diff --git a/ArduPilotInterface_8h_source.html b/ArduPilotInterface_8h_source.html index 1163ea1b..58cec4a6 100644 --- a/ArduPilotInterface_8h_source.html +++ b/ArduPilotInterface_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/ardupilot/ArduPilotInterface.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
ArduPilotInterface.h
@@ -106,7 +114,8 @@
+ diff --git a/ArduPilotProtocol_8h_source.html b/ArduPilotProtocol_8h_source.html index 08e480f0..c001d16c 100644 --- a/ArduPilotProtocol_8h_source.html +++ b/ArduPilotProtocol_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/ardupilot/ArduPilotProtocol.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
ArduPilotProtocol.h
@@ -190,11 +198,12 @@
Definition ArduPilotProtocol.h:15
A WebSocket server class that only accepts a single client at a time to each endpoint served by this ...
Definition WebSocketServer.h:35
-
Represents data measured using a sensor at a given time.
Definition data.h:113
+
Represents data measured using a sensor at a given time.
Definition data.h:119
+ diff --git a/ArmKinematics_8h_source.html b/ArmKinematics_8h_source.html index b218d9e8..c873a924 100644 --- a/ArmKinematics_8h_source.html +++ b/ArmKinematics_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/kinematics/ArmKinematics.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
ArmKinematics.h
@@ -108,7 +116,7 @@
20public:
21 ArmKinematics(std::shared_ptr<const ForwardArmKinematics<D, N>> forwardKin,
22 std::shared_ptr<const InverseArmKinematics<D, N>> inverseKin)
-
23 : InverseArmKinematics<D, N>(forwardKin), ik(inverseKin) {}
+
23 : InverseArmKinematics<D, N>(forwardKin), ik(inverseKin) {}
24
25 bool satisfiesConstraints(const navtypes::Vectord<N>& jointPos) const override {
@@ -160,10 +168,12 @@
navtypes::Vectord< D > jointPosToEEPos(const navtypes::Vectord< N > &jointPos) const override
Given a joint position, calculate the current EE position.
Definition ArmKinematics.h:33
A class that calculates the forward kinematics of an arm.
Definition ForwardArmKinematics.h:16
A class that calculates the inverse kinematics of an arm.
Definition InverseArmKinematics.h:19
+
InverseArmKinematics(std::shared_ptr< const ForwardArmKinematics< D, N > > fk)
Construct an IK object.
Definition InverseArmKinematics.h:26
+ diff --git a/AutonomousTask_8h_source.html b/AutonomousTask_8h_source.html index 495c260e..833fa256 100644 --- a/AutonomousTask_8h_source.html +++ b/AutonomousTask_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/autonomous/AutonomousTask.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
AutonomousTask.h
@@ -158,7 +166,8 @@
+ diff --git a/CANMotor_8h_source.html b/CANMotor_8h_source.html index 722b45f2..ae7424ce 100644 --- a/CANMotor_8h_source.html +++ b/CANMotor_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/CAN/CANMotor.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
CANMotor.h
@@ -151,7 +159,7 @@
-
Represents data measured using a sensor at a given time.
Definition data.h:113
+
Represents data measured using a sensor at a given time.
Definition data.h:119
Utilities for interacting with motor boards over a CAN interface.
Definition CANMotor.cpp:20
void pullMotorPosition(deviceserial_t serial)
Poll the position data from a motor board.
Definition CANMotor.cpp:131
void setMotorPower(deviceserial_t serial, double power)
Set the power output of a motor board.
Definition CANMotor.cpp:100
@@ -177,7 +185,8 @@
+ diff --git a/CANUtils_8h_source.html b/CANUtils_8h_source.html index 0a62b8c1..5de9a229 100644 --- a/CANUtils_8h_source.html +++ b/CANUtils_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/CAN/CANUtils.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
CANUtils.h
@@ -191,7 +199,8 @@
+ diff --git a/CAN_8h_source.html b/CAN_8h_source.html index 665b3a36..dc23d235 100644 --- a/CAN_8h_source.html +++ b/CAN_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/CAN/CAN.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
CAN.h
@@ -136,7 +144,7 @@
-
Represents data measured using a sensor at a given time.
Definition data.h:113
+
Represents data measured using a sensor at a given time.
Definition data.h:119
Utilities for interacting with CAN devices.
Definition CAN.cpp:43
void unscheduleTelemetryPull(deviceid_t id, telemtype_t telemType)
Stop pulling the latest telemetry data from the given device.
Definition CAN.cpp:337
robot::types::DataPoint< telemetry_t > getDeviceTelemetry(deviceid_t id, telemtype_t telemType)
Get the latest telemetry from a CAN device.
Definition CAN.cpp:285
@@ -150,7 +158,8 @@
+ diff --git a/CameraConfig_8h_source.html b/CameraConfig_8h_source.html index 99dc635c..88a33a09 100644 --- a/CameraConfig_8h_source.html +++ b/CameraConfig_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/camera/CameraConfig.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
CameraConfig.h
@@ -145,7 +153,7 @@
Exception for errors in the camera configuration.
Definition CameraConfig.h:58
virtual const char * what() const noexcept
Returns the exception message as a C string.
Definition CameraConfig.cpp:11
-
invalid_camera_config()
Constructs an invalid_camera_config exception with the default message "Invalid camera configuration"...
Definition CameraConfig.cpp:6
+
invalid_camera_config()
Constructs an invalid_camera_config exception with the default message "Invalid cameraconfiguration".
Definition CameraConfig.cpp:6
const std::string KEY_NAME
Config file key for camera name.
Definition CameraConfig.h:48
const std::string KEY_FILENAME
Config file key for camera filename.
Definition CameraConfig.h:28
@@ -165,7 +173,8 @@
+ diff --git a/CameraParams_8h_source.html b/CameraParams_8h_source.html index 6ee61dac..56786d39 100644 --- a/CameraParams_8h_source.html +++ b/CameraParams_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/camera/CameraParams.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
CameraParams.h
@@ -164,7 +172,8 @@
+ diff --git a/Camera_8h_source.html b/Camera_8h_source.html index d5d29b0e..cb544c6f 100644 --- a/Camera_8h_source.html +++ b/Camera_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/camera/Camera.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
Camera.h
@@ -189,7 +197,8 @@
+ diff --git a/CommandBase_8h_source.html b/CommandBase_8h_source.html index dcaafa46..d3c44e42 100644 --- a/CommandBase_8h_source.html +++ b/CommandBase_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/commands/CommandBase.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
CommandBase.h
@@ -116,7 +124,8 @@
+ diff --git a/Constants_8h_source.html b/Constants_8h_source.html index 00c26668..7916f336 100644 --- a/Constants_8h_source.html +++ b/Constants_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/Constants.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
Constants.h
@@ -224,12 +232,13 @@
::uint32_t uint32_t
::uint16_t uint16_t
-
std::string CameraID
The type of a camera id.
Definition data.h:45
-
motorid_t
The motors on the robot.
Definition data.h:56
+
std::string CameraID
The type of a camera id.
Definition data.h:46
+
motorid_t
The motors on the robot.
Definition data.h:57
+ diff --git a/Detector_8h_source.html b/Detector_8h_source.html index 502a2529..138b035a 100644 --- a/Detector_8h_source.html +++ b/Detector_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/ar/Detector.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
Detector.h
@@ -146,7 +154,8 @@
+ diff --git a/DiffDriveKinematics_8h_source.html b/DiffDriveKinematics_8h_source.html index 327b7b72..f0d10b6d 100644 --- a/DiffDriveKinematics_8h_source.html +++ b/DiffDriveKinematics_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/kinematics/DiffDriveKinematics.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
DiffDriveKinematics.h
@@ -149,7 +157,8 @@
+ diff --git a/DiffWristKinematics_8h_source.html b/DiffWristKinematics_8h_source.html index 4f0219ba..4013a875 100644 --- a/DiffWristKinematics_8h_source.html +++ b/DiffWristKinematics_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/kinematics/DiffWristKinematics.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
DiffWristKinematics.h
@@ -134,18 +142,19 @@
jointpos_t gearPowerToJointPower(const gearpos_t &gearPwr) const
Given the motor power of each gear, calculate the resulting power of each axis of the joint.
Definition DiffWristKinematics.cpp:39
Represents the positions (or power) of the two motor-driven gears in the differential wrist.
Definition DiffWristKinematics.h:14
float right
The position (or power) of the right gear.
Definition DiffWristKinematics.h:30
-
gearpos_t(const Eigen::Vector2f &vec)
Constructs a set of gear positions from a 2-component vector as .
-
Eigen::Vector2f vec() const
Converts a set of gear positions to a 2-component vector as .
Definition DiffWristKinematics.cpp:10
+
gearpos_t(const Eigen::Vector2f &vec)
Constructs a set of gear positions from a 2-component vector as .
+
Eigen::Vector2f vec() const
Converts a set of gear positions to a 2-component vector as .
Definition DiffWristKinematics.cpp:10
float left
The position (or power) of the left gear.
Definition DiffWristKinematics.h:22
Represents the position (or power) of the differential wrist joint.
Definition DiffWristKinematics.h:49
-
Eigen::Vector2f vec() const
Converts a set of gear positions to a 2-component vector as .
Definition DiffWristKinematics.cpp:16
-
jointpos_t(const Eigen::Vector2f &vec)
Constructs a joint position from a 2-component vector as .
+
Eigen::Vector2f vec() const
Converts a set of gear positions to a 2-component vector as .
Definition DiffWristKinematics.cpp:16
+
jointpos_t(const Eigen::Vector2f &vec)
Constructs a joint position from a 2-component vector as .
float pitch
The pitch of the end effector.
Definition DiffWristKinematics.h:56
float roll
The roll of the end effector.
Definition DiffWristKinematics.h:63
+ diff --git a/DriveToWaypointCommand_8h_source.html b/DriveToWaypointCommand_8h_source.html index 84b6d95d..16575c88 100644 --- a/DriveToWaypointCommand_8h_source.html +++ b/DriveToWaypointCommand_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/commands/DriveToWaypointCommand.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
DriveToWaypointCommand.h
@@ -145,7 +153,8 @@
+ diff --git a/ExtendedKalmanFilter_8h_source.html b/ExtendedKalmanFilter_8h_source.html index 74908db3..54065969 100644 --- a/ExtendedKalmanFilter_8h_source.html +++ b/ExtendedKalmanFilter_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/filters/ExtendedKalmanFilter.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
ExtendedKalmanFilter.h
@@ -164,16 +172,16 @@
97
103 std::function<Eigen::Matrix<double, stateDim, stateDim>(const state_t&, const input_t&,
104 const processnoise_t&)>
-
105 stateFuncJacobianX;
+
105 stateFuncJacobianX;
111 std::function<Eigen::Matrix<double, stateDim, processNoiseDim>(
112 const state_t&, const input_t&, const processnoise_t&)>
-
113 stateFuncJacobianW;
+
113 stateFuncJacobianW;
119 std::function<Eigen::Matrix<double, outputDim, stateDim>(const state_t&,
120 const outputnoise_t&)>
-
121 outputFuncJacobianX;
+
121 outputFuncJacobianX;
127 std::function<Eigen::Matrix<double, outputDim, outputNoiseDim>(const state_t&,
128 const outputnoise_t&)>
-
129 outputFuncJacobianV;
+
129 outputFuncJacobianV;
130
131private:
132 statefunc_t stateFunc;
@@ -188,8 +196,8 @@
141 getStateFuncJacobianX(const statefunc_t& f, const state_t& x, const input_t& u) const {
142 processnoise_t w = processnoise_t::Zero();
143 // If we have an analytic solution, use that
-
144 if (stateFuncJacobianX) {
-
145 return stateFuncJacobianX(x, u, w);
+
144 if (stateFuncJacobianX) {
+
145 return stateFuncJacobianX(x, u, w);
146 } else {
147 Eigen::Matrix<double, stateDim, stateDim> jacobian;
148 for (int i = 0; i < stateDim; i++) {
@@ -206,8 +214,8 @@
159 getStateFuncJacobianW(const statefunc_t& f, const state_t& x, const input_t& u) const {
160 processnoise_t w = processnoise_t::Zero();
161 // If we have an analytic solution, use that
-
162 if (stateFuncJacobianW) {
-
163 return stateFuncJacobianW(x, u, w);
+
162 if (stateFuncJacobianW) {
+
163 return stateFuncJacobianW(x, u, w);
164 } else {
165 Eigen::Matrix<double, stateDim, processNoiseDim> jacobian;
166 for (int i = 0; i < processNoiseDim; i++) {
@@ -224,8 +232,8 @@
177 const state_t& x) const {
178 outputnoise_t v = outputnoise_t::Zero();
179 // If we have an analytic solution, use that
-
180 if (outputFuncJacobianX) {
-
181 return outputFuncJacobianX(x, v);
+
180 if (outputFuncJacobianX) {
+
181 return outputFuncJacobianX(x, v);
182 } else {
183 Eigen::Matrix<double, outputDim, stateDim> jacobian;
184 for (int i = 0; i < stateDim; i++) {
@@ -242,8 +250,8 @@
195 getOutputFuncJacobianV(const outputfunc_t& f, const state_t& x) const {
196 outputnoise_t v = outputnoise_t::Zero();
197 // If we have an analytic solution, use that
-
198 if (outputFuncJacobianV) {
-
199 return outputFuncJacobianV(x, v);
+
198 if (outputFuncJacobianV) {
+
199 return outputFuncJacobianV(x, v);
200 } else {
201 Eigen::Matrix<double, outputDim, outputNoiseDim> jacobian;
202 for (int i = 0; i < outputNoiseDim; i++) {
@@ -264,12 +272,12 @@
static const IdentityReturnType Identity()
Implements a discrete-time EKF.
Definition ExtendedKalmanFilter.h:29
-
std::function< Eigen::Matrix< double, outputDim, stateDim >(const state_t &, const outputnoise_t &) outputFuncJacobianX)
Set this to provide an analytic solution to dh/dx.
Definition ExtendedKalmanFilter.h:121
+
std::function< Eigen::Matrix< double, stateDim, stateDim >(const state_t &, const input_t &, const processnoise_t &)> stateFuncJacobianX
Set this to provide an analytic solution to df/dx.
Definition ExtendedKalmanFilter.h:105
void correct(const Eigen::Matrix< double, outputDim, 1 > &measurement)
Correct the state estimate with measurement data.
Definition ExtendedKalmanFilter.h:77
+
std::function< Eigen::Matrix< double, outputDim, outputNoiseDim >(const state_t &, const outputnoise_t &)> outputFuncJacobianV
Set this to provide an analytic solution to dh/dv.
Definition ExtendedKalmanFilter.h:129
+
std::function< Eigen::Matrix< double, outputDim, stateDim >(const state_t &, const outputnoise_t &)> outputFuncJacobianX
Set this to provide an analytic solution to dh/dx.
Definition ExtendedKalmanFilter.h:121
+
std::function< Eigen::Matrix< double, stateDim, processNoiseDim >(const state_t &, const input_t &, const processnoise_t &)> stateFuncJacobianW
Set this to provide an analytic solution to df/dw.
Definition ExtendedKalmanFilter.h:113
void predict(const Eigen::Matrix< double, inputDim, 1 > &input) override
Use the model to predict the next system state, given the current inputs.
Definition ExtendedKalmanFilter.h:57
-
std::function< Eigen::Matrix< double, stateDim, stateDim >(const state_t &, const input_t &, const processnoise_t &) stateFuncJacobianX)
Set this to provide an analytic solution to df/dx.
Definition ExtendedKalmanFilter.h:105
-
std::function< Eigen::Matrix< double, stateDim, processNoiseDim >(const state_t &, const input_t &, const processnoise_t &) stateFuncJacobianW)
Set this to provide an analytic solution to df/dw.
Definition ExtendedKalmanFilter.h:113
-
std::function< Eigen::Matrix< double, outputDim, outputNoiseDim >(const state_t &, const outputnoise_t &) outputFuncJacobianV)
Set this to provide an analytic solution to dh/dv.
Definition ExtendedKalmanFilter.h:129
ExtendedKalmanFilter(const statefunc_t &stateFunc, const outputfunc_t &outputFunc, const statespace::NoiseCovMat< stateDim, processNoiseDim, inputDim > &processNoise, const statespace::NoiseCovMat< stateDim, outputNoiseDim, outputDim > &outputNoise, double dt)
Create a new discrete-time EKF.
Definition ExtendedKalmanFilter.h:50
Base class for Kalman Filters.
Definition KalmanFilterBase.h:15
Represents a square noise covariance matrix.
Definition StateSpaceUtil.h:249
@@ -279,7 +287,8 @@
+ diff --git a/FabrikSolver_8h_source.html b/FabrikSolver_8h_source.html index 57bf28ea..dc4f3a29 100644 --- a/FabrikSolver_8h_source.html +++ b/FabrikSolver_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/kinematics/FabrikSolver.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
FabrikSolver.h
@@ -210,7 +218,8 @@
+ diff --git a/ForwardArmKinematics_8h_source.html b/ForwardArmKinematics_8h_source.html index 0ff00eb7..b10c0eca 100644 --- a/ForwardArmKinematics_8h_source.html +++ b/ForwardArmKinematics_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/kinematics/ForwardArmKinematics.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
ForwardArmKinematics.h
@@ -158,7 +166,8 @@
+ diff --git a/Globals_8h_source.html b/Globals_8h_source.html index c42fc666..5db04bb3 100644 --- a/Globals_8h_source.html +++ b/Globals_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/Globals.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
Globals.h
@@ -123,11 +131,12 @@
Controller to move planar arm to a target end effector position.
Definition PlanarArmController.h:28
A WebSocket server class that only accepts a single client at a time to each endpoint served by this ...
Definition WebSocketServer.h:35
-
mountedperipheral_t
the mounted peripheral on the robot.
Definition data.h:71
+
mountedperipheral_t
the mounted peripheral on the robot.
Definition data.h:72
+ diff --git a/H264Encoder_8h_source.html b/H264Encoder_8h_source.html index a7006ca4..f4167cac 100644 --- a/H264Encoder_8h_source.html +++ b/H264Encoder_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/video/H264Encoder.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
H264Encoder.h
@@ -128,7 +136,8 @@
+ diff --git a/InverseArmKinematics_8h_source.html b/InverseArmKinematics_8h_source.html index 70cb226c..298f478c 100644 --- a/InverseArmKinematics_8h_source.html +++ b/InverseArmKinematics_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/kinematics/InverseArmKinematics.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
InverseArmKinematics.h
@@ -158,7 +166,8 @@
+ diff --git a/JacobianPosController_8h_source.html b/JacobianPosController_8h_source.html index 3ce16e51..3a7e21bb 100644 --- a/JacobianPosController_8h_source.html +++ b/JacobianPosController_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/control/JacobianPosController.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
JacobianPosController.h
@@ -224,7 +232,8 @@
+ diff --git a/JacobianVelController_8h_source.html b/JacobianVelController_8h_source.html index 35fd1374..41d3f2a9 100644 --- a/JacobianVelController_8h_source.html +++ b/JacobianVelController_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/control/JacobianVelController.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
JacobianVelController.h
@@ -225,7 +233,8 @@
+ diff --git a/KalmanFilterBase_8h_source.html b/KalmanFilterBase_8h_source.html index 8ac76d16..26e95855 100644 --- a/KalmanFilterBase_8h_source.html +++ b/KalmanFilterBase_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/filters/KalmanFilterBase.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
KalmanFilterBase.h
@@ -170,7 +178,8 @@
+ diff --git a/KalmanFilter_8h_source.html b/KalmanFilter_8h_source.html index 7eae62e1..b045c837 100644 --- a/KalmanFilter_8h_source.html +++ b/KalmanFilter_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/filters/KalmanFilter.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
KalmanFilter.h
@@ -244,7 +252,8 @@
+ diff --git a/MarkerPattern_8h_source.html b/MarkerPattern_8h_source.html index 43cbb567..10cbe6cc 100644 --- a/MarkerPattern_8h_source.html +++ b/MarkerPattern_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/ar/MarkerPattern.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
MarkerPattern.h
@@ -132,7 +140,8 @@
+ diff --git a/MarkerSet_8h_source.html b/MarkerSet_8h_source.html index b2e4f0b4..639201a4 100644 --- a/MarkerSet_8h_source.html +++ b/MarkerSet_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/ar/MarkerSet.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
MarkerSet.h
@@ -187,7 +195,8 @@
+ diff --git a/MissionControlMessages_8h_source.html b/MissionControlMessages_8h_source.html index ec732e9b..36897573 100644 --- a/MissionControlMessages_8h_source.html +++ b/MissionControlMessages_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/network/MissionControlMessages.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
MissionControlMessages.h
@@ -121,7 +129,8 @@
+ diff --git a/MissionControlProtocol_8h_source.html b/MissionControlProtocol_8h_source.html index c5424a74..09285d90 100644 --- a/MissionControlProtocol_8h_source.html +++ b/MissionControlProtocol_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/network/MissionControlProtocol.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
MissionControlProtocol.h
@@ -174,11 +182,12 @@
Defines a protocol which will be served at an endpoint of a server.
Definition WebSocketProtocol.h:30
basic_json<> json
-
std::string CameraID
The type of a camera id.
Definition data.h:45
+
std::string CameraID
The type of a camera id.
Definition data.h:46
+ diff --git a/MissionControlTasks_8h_source.html b/MissionControlTasks_8h_source.html index ade46376..360a6a5c 100644 --- a/MissionControlTasks_8h_source.html +++ b/MissionControlTasks_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/network/MissionControlTasks.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
MissionControlTasks.h
@@ -201,11 +209,12 @@
An abstract class that can be overridden to run long-running tasks and encapsulate task-related data.
Definition scheduler.h:316
Implements a task that executes a function periodically.
Definition scheduler.h:484
Namespace for camera access system.
Definition Camera.cpp:13
-
std::string CameraID
The type of a camera id.
Definition data.h:45
+
std::string CameraID
The type of a camera id.
Definition data.h:46
+ diff --git a/MultiSensorEKF_8h_source.html b/MultiSensorEKF_8h_source.html index 4d6299f6..78d3fe8d 100644 --- a/MultiSensorEKF_8h_source.html +++ b/MultiSensorEKF_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/filters/MultiSensorEKF.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
MultiSensorEKF.h
@@ -322,7 +330,8 @@
+ diff --git a/PIDControl_8h_source.html b/PIDControl_8h_source.html index 8c52820f..9be77936 100644 --- a/PIDControl_8h_source.html +++ b/PIDControl_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/control/PIDControl.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
PIDControl.h
@@ -226,7 +234,8 @@
+ diff --git a/PlanarArmController_8h_source.html b/PlanarArmController_8h_source.html index 3fd660d6..89a1348a 100644 --- a/PlanarArmController_8h_source.html +++ b/PlanarArmController_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/control/PlanarArmController.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
PlanarArmController.h
@@ -334,7 +342,8 @@
+ diff --git a/PlanarArmFK_8h_source.html b/PlanarArmFK_8h_source.html index b6168c59..36f91872 100644 --- a/PlanarArmFK_8h_source.html +++ b/PlanarArmFK_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/kinematics/PlanarArmFK.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
PlanarArmFK.h
@@ -188,7 +196,8 @@
+ diff --git a/RollingAvgFilter_8h_source.html b/RollingAvgFilter_8h_source.html index 8c631f6c..8b30a5fd 100644 --- a/RollingAvgFilter_8h_source.html +++ b/RollingAvgFilter_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/filters/RollingAvgFilter.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
RollingAvgFilter.h
@@ -177,7 +185,8 @@
+ diff --git a/ScopedTimer_8h_source.html b/ScopedTimer_8h_source.html index ef85ec8b..739c2b1c 100644 --- a/ScopedTimer_8h_source.html +++ b/ScopedTimer_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/utils/ScopedTimer.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
ScopedTimer.h
@@ -128,7 +136,8 @@
+ diff --git a/StateSpaceUtil_8h_source.html b/StateSpaceUtil_8h_source.html index 08e31123..a2863c06 100644 --- a/StateSpaceUtil_8h_source.html +++ b/StateSpaceUtil_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/filters/StateSpaceUtil.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
StateSpaceUtil.h
@@ -338,7 +346,8 @@
+ diff --git a/SwerveDriveKinematics_8h_source.html b/SwerveDriveKinematics_8h_source.html index 372b0f78..96cd343a 100644 --- a/SwerveDriveKinematics_8h_source.html +++ b/SwerveDriveKinematics_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/kinematics/SwerveDriveKinematics.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
SwerveDriveKinematics.h
@@ -150,7 +158,8 @@
+ diff --git a/Tag_8h_source.html b/Tag_8h_source.html index 947d3fb2..fb73ea6f 100644 --- a/Tag_8h_source.html +++ b/Tag_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/ar/Tag.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
Tag.h
@@ -128,7 +136,8 @@
+ diff --git a/TrapezoidalVelocityProfile_8h_source.html b/TrapezoidalVelocityProfile_8h_source.html index a353c22e..37343d4b 100644 --- a/TrapezoidalVelocityProfile_8h_source.html +++ b/TrapezoidalVelocityProfile_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/control/TrapezoidalVelocityProfile.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
TrapezoidalVelocityProfile.h
@@ -270,7 +278,8 @@
+ diff --git a/WebSocketProtocol_8h_source.html b/WebSocketProtocol_8h_source.html index 4533b4dc..364c71b1 100644 --- a/WebSocketProtocol_8h_source.html +++ b/WebSocketProtocol_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/network/websocket/WebSocketProtocol.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
WebSocketProtocol.h
@@ -181,7 +189,8 @@
+ diff --git a/WebSocketServer_8h_source.html b/WebSocketServer_8h_source.html index 3da0acdd..267e8681 100644 --- a/WebSocketServer_8h_source.html +++ b/WebSocketServer_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/network/websocket/WebSocketServer.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
WebSocketServer.h
@@ -201,7 +209,8 @@
+ diff --git a/annotated.html b/annotated.html index 42c9c2a7..fa305ec8 100644 --- a/annotated.html +++ b/annotated.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Class List + + @@ -39,24 +41,35 @@ - + + +
+
 CWebSocketProtocolDefines a protocol which will be served at an endpoint of a server  NrobotCollection of functions for manipulating a motor  NtypesTypes for use in the world interface - CDataPointRepresents data measured using a sensor at a given time - CLimitSwitchDataA class that represents limit switches from a specific motor - Cbase_motorAn abstract motor class - Ccan_motor - Cencparams_t - Cpidcoef_tA struct containing a set of PID coefficients - Cpotparams_tRepresents parameters defining a potentiometer scale - Csim_motor - Nstd - Chash< std::pair< T1, T2 > > - NutilA collection of utility functions and classes with common use-cases - Nimpl - CNotifiable - CAsyncTaskAn abstract class that can be overridden to run long-running tasks and encapsulate task-related data - ClatchImplementation of a countdown latch for threading synchronization - CPeriodicSchedulerUses a single thread to periodically invoke callbacks at a given frequency - CPeriodicTaskImplements a task that executes a function periodically - CRAIIHelperA helper class for executing a function when leaving a scope, in RAII-style - CScopedTimerA utility class that helps with timing - CWatchdogImplements a thread-safe watchdog - Nvideo - CH264EncoderThis class encodes OpenCV frames into encoded H264 data that can be sent to an H264 decoder, like JMuxer - CGPSDatumA GPS datum that specifies the reference ellipsoid for use in GPS calculations - CGPSToMetersConverterA class used to convert gps coordinates to coordinates on a flat xy-plane, and vice versa - CJacobianVelControllerThis class controls the velocity of a multidimensional mechanism by commanding its position using the jacobian of the kinematics + Cbad_datapoint_access + CDataPointRepresents data measured using a sensor at a given time + CLimitSwitchDataA class that represents limit switches from a specific motor + Cbase_motorAn abstract motor class + Ccan_motor + Cencparams_t + Cpidcoef_tA struct containing a set of PID coefficients + Cpotparams_tRepresents parameters defining a potentiometer scale + Csim_motor + Nstd + Chash< std::pair< T1, T2 > > + NutilA collection of utility functions and classes with common use-cases + Nimpl + CNotifiable + CAsyncTaskAn abstract class that can be overridden to run long-running tasks and encapsulate task-related data + ClatchImplementation of a countdown latch for threading synchronization + CPeriodicSchedulerUses a single thread to periodically invoke callbacks at a given frequency + CPeriodicTaskImplements a task that executes a function periodically + CRAIIHelperA helper class for executing a function when leaving a scope, in RAII-style + CScopedTimerA utility class that helps with timing + CWatchdogImplements a thread-safe watchdog + Nvideo + CH264EncoderThis class encodes OpenCV frames into encoded H264 data that can be sent to an H264 decoder, like JMuxer + CGPSDatumA GPS datum that specifies the reference ellipsoid for use in GPS calculations + CGPSToMetersConverterA class used to convert gps coordinates to coordinates on a flat xy-plane, and vice versa + CJacobianVelControllerThis class controls the velocity of a multidimensional mechanism by commanding its position using the jacobian of the kinematics
+ diff --git a/base64_8h_source.html b/base64_8h_source.html index 5afb19a7..974a96ef 100644 --- a/base64_8h_source.html +++ b/base64_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/base64/base64.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
base64.h
@@ -141,7 +149,8 @@
+ diff --git a/base64__img_8h_source.html b/base64__img_8h_source.html index 240fdeb5..55758b94 100644 --- a/base64__img_8h_source.html +++ b/base64__img_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/base64/base64_img.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
base64_img.h
@@ -113,7 +121,8 @@
+ diff --git a/base__motor_8h_source.html b/base__motor_8h_source.html index 0e341d06..dc720253 100644 --- a/base__motor_8h_source.html +++ b/base__motor_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/world_interface/motor/base_motor.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
base_motor.h
@@ -136,21 +144,22 @@
virtual types::DataPoint< int32_t > getMotorPos() const =0
Get the last reported position of the specified motor.
base_motor(robot::types::motorid_t motor, bool hasPosSensor)
Constructor for base motor.
Definition base_motor.cpp:6
base_motor & operator=(const base_motor &)=delete
Delete the copy operator.
-
void unscheduleVelocityEvent()
Unschedules the velocity event if it exists.
Definition base_motor.cpp:68
+
void unscheduleVelocityEvent()
Unschedules the velocity event if it exists.
Definition base_motor.cpp:71
bool hasPositionSensor() const
Returns the status of the motor position sensor.
Definition base_motor.cpp:15
virtual void setMotorVel(int32_t targetVel)
Sets the velocity of the motor.
Definition base_motor.cpp:19
virtual void setMotorPower(double power)=0
Set the PWM command of the motor.
-
void constructVelController()
Constructs a Jacobian Vel Controller.
Definition base_motor.cpp:42
+
void constructVelController()
Constructs a Jacobian Vel Controller.
Definition base_motor.cpp:45
virtual void setMotorPos(int32_t targetPos)=0
Set the target position of the motor.
base_motor(const base_motor &)=delete
Delete the copy constructor.
-
Represents data measured using a sensor at a given time.
Definition data.h:113
+
Represents data measured using a sensor at a given time.
Definition data.h:119
::int32_t int32_t
-
motorid_t
The motors on the robot.
Definition data.h:56
+
motorid_t
The motors on the robot.
Definition data.h:57
Collection of functions for manipulating a motor.
Definition ArduPilotInterface.cpp:27
+ diff --git a/cameraconfig.html b/cameraconfig.html index 22651909..d01311ce 100644 --- a/cameraconfig.html +++ b/cameraconfig.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Camera Configuration + + @@ -39,23 +41,33 @@ - + + +
+
Camera Configuration
@@ -149,7 +162,8 @@

+
diff --git a/can__motor_8h_source.html b/can__motor_8h_source.html index 83ba33c8..ebddeaaa 100644 --- a/can__motor_8h_source.html +++ b/can__motor_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/world_interface/motor/can_motor.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
can_motor.h
@@ -133,16 +141,17 @@
void setMotorVel(int32_t targetVel) override
Sets the velocity of the motor.
Definition can_motor.cpp:34
void setMotorPos(int32_t targetPos) override
Set the target position of the motor.
Definition can_motor.cpp:21
can_motor(robot::types::motorid_t motor, bool hasPosSensor, can::deviceserial_t serial, double pos_pwm_scale, double neg_pwm_scale)
Constructor for can motor.
Definition can_motor.cpp:4
-
Represents data measured using a sensor at a given time.
Definition data.h:113
+
Represents data measured using a sensor at a given time.
Definition data.h:119
motormode_t
The possible motor modes.
Definition CANMotor.h:19
uint8_t deviceserial_t
The type of the device serial number.
Definition CANUtils.h:64
::int32_t int32_t
-
motorid_t
The motors on the robot.
Definition data.h:56
+
motorid_t
The motors on the robot.
Definition data.h:57
Collection of functions for manipulating a motor.
Definition ArduPilotInterface.cpp:27
+ diff --git a/classAR_1_1Detector-members.html b/classAR_1_1Detector-members.html index c390f2fd..cce7c1c2 100644 --- a/classAR_1_1Detector-members.html +++ b/classAR_1_1Detector-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@ - + + + +
AR::Detector Member List
@@ -99,7 +112,8 @@
+ diff --git a/classAR_1_1Detector.html b/classAR_1_1Detector.html index cd4d1cf7..69bdec2f 100644 --- a/classAR_1_1Detector.html +++ b/classAR_1_1Detector.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): AR::Detector Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -118,7 +131,8 @@
+
diff --git a/classAR_1_1MarkerPattern-members.html b/classAR_1_1MarkerPattern-members.html index ab718a96..6a113735 100644 --- a/classAR_1_1MarkerPattern-members.html +++ b/classAR_1_1MarkerPattern-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
AR::MarkerPattern Member List
@@ -100,7 +113,8 @@
+ diff --git a/classAR_1_1MarkerPattern.html b/classAR_1_1MarkerPattern.html index c323d4f6..16b9af70 100644 --- a/classAR_1_1MarkerPattern.html +++ b/classAR_1_1MarkerPattern.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): AR::MarkerPattern Class Reference + + @@ -39,23 +41,33 @@ - + + + +
diff --git a/classAR_1_1MarkerSet-members.html b/classAR_1_1MarkerSet-members.html index fd990b4e..641ff429 100644 --- a/classAR_1_1MarkerSet-members.html +++ b/classAR_1_1MarkerSet-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
AR::MarkerSet Member List
@@ -106,7 +119,8 @@
+ diff --git a/classAR_1_1MarkerSet.html b/classAR_1_1MarkerSet.html index 7954231c..d41a7d39 100644 --- a/classAR_1_1MarkerSet.html +++ b/classAR_1_1MarkerSet.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): AR::MarkerSet Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -161,17 +174,17 @@

AR::MarkerSet::MarkerSet ( - uint8_t data_region_size, + uint8_t data_region_size, - uint8_t border_size, + uint8_t border_size, - float physical_size, + float physical_size, @@ -201,17 +214,17 @@

AR::MarkerSet::MarkerSet ( - uint8_t data_region_size, + uint8_t data_region_size, - uint8_t border_size, + uint8_t border_size, - float physical_size, + float physical_size, @@ -242,7 +255,7 @@

uint8_t AR::MarkerSet::getBorderSize ( - ) + ) const @@ -262,7 +275,7 @@

uint8_t AR::MarkerSet::getDataRegionSize ( - ) + ) const @@ -332,7 +345,7 @@

bool AR::MarkerSet::getMarkerByID ( - int id, + int id, @@ -356,7 +369,7 @@

bool AR::MarkerSet::getMarkerByMappedID ( - int mapped_id, + int mapped_id, @@ -380,7 +393,7 @@

float AR::MarkerSet::getPhysicalSize ( - ) + ) const @@ -398,7 +411,8 @@

+

diff --git a/classAR_1_1Tag-members.html b/classAR_1_1Tag-members.html index 8d12e80f..896fa04d 100644 --- a/classAR_1_1Tag-members.html +++ b/classAR_1_1Tag-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
AR::Tag Member List
@@ -98,7 +111,8 @@
+ diff --git a/classAR_1_1Tag.html b/classAR_1_1Tag.html index 8b059893..2c97f2a8 100644 --- a/classAR_1_1Tag.html +++ b/classAR_1_1Tag.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): AR::Tag Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -127,7 +140,7 @@

cv::Vec3d AR::Tag::getCoordinates ( - ) + ) const @@ -148,7 +161,7 @@

cv::Vec3d AR::Tag::getRVec ( - ) + ) const @@ -168,7 +181,7 @@

cv::Vec3d AR::Tag::getTVec ( - ) + ) const @@ -187,7 +200,8 @@

+

diff --git a/classGPSDatum-members.html b/classGPSDatum-members.html index fc660d07..6f9ff817 100644 --- a/classGPSDatum-members.html +++ b/classGPSDatum-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
GPSDatum Member List
@@ -94,7 +107,8 @@
+
diff --git a/classGPSDatum.html b/classGPSDatum.html index 513ad780..98c4c0b8 100644 --- a/classGPSDatum.html +++ b/classGPSDatum.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): GPSDatum Class Reference + + @@ -39,23 +41,33 @@ - + + +
+
diff --git a/classGPSToMetersConverter-members.html b/classGPSToMetersConverter-members.html index a4126c1b..cfbb7154 100644 --- a/classGPSToMetersConverter-members.html +++ b/classGPSToMetersConverter-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
GPSToMetersConverter Member List
@@ -93,7 +106,8 @@
+
diff --git a/classGPSToMetersConverter.html b/classGPSToMetersConverter.html index 1adde3f7..98640ee2 100644 --- a/classGPSToMetersConverter.html +++ b/classGPSToMetersConverter.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): GPSToMetersConverter Class Reference + + @@ -39,23 +41,33 @@ - + + +
+
diff --git a/classJacobianVelController-members.html b/classJacobianVelController-members.html index 3b8436f7..38308eee 100644 --- a/classJacobianVelController-members.html +++ b/classJacobianVelController-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
JacobianVelController< outputDim, inputDim > Member List
@@ -94,7 +107,8 @@
+
diff --git a/classJacobianVelController.html b/classJacobianVelController.html index 13d265ba..2e83b2a6 100644 --- a/classJacobianVelController.html +++ b/classJacobianVelController.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): JacobianVelController< outputDim, inputDim > Class Template Reference + + @@ -39,23 +41,33 @@ - + + +
+
Public Member Functions | @@ -139,7 +152,7 @@

JacobianVelController< outputDim, inputDim >::JacobianVelController ( - const std::function< navtypes::Vectord< outputDim >(const navtypes::Vectord< inputDim > &)> & kinematicsFunc, + const std::function< navtypes::Vectord< outputDim >(const navtypes::Vectord< inputDim > &)> & kinematicsFunc, @@ -180,7 +193,7 @@

navtypes::Vectord< inputDim > JacobianVelController< outputDim, inputDim >::getCommand ( - robot::types::datatime_t currTime, + robot::types::datatime_t currTime, @@ -221,12 +234,12 @@

navtypes::Vectord< inputDim > JacobianVelController< outputDim, inputDim >::getCommand ( - robot::types::datatime_t currTime, + robot::types::datatime_t currTime, - const navtypes::Vectord< inputDim > & currPos, + const navtypes::Vectord< inputDim > & currPos, @@ -268,7 +281,7 @@

bool JacobianVelController< outputDim, inputDim >::hasTarget ( - ) + ) @@ -298,7 +311,7 @@

void JacobianVelController< outputDim, inputDim >::setTarget ( - robot::types::datatime_t currTime, + robot::types::datatime_t currTime, @@ -330,7 +343,8 @@

+

diff --git a/classautonomous_1_1AutonomousTask-members.html b/classautonomous_1_1AutonomousTask-members.html index 1d3f98a7..475390a3 100644 --- a/classautonomous_1_1AutonomousTask-members.html +++ b/classautonomous_1_1AutonomousTask-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
autonomous::AutonomousTask Member List
@@ -96,7 +109,8 @@
+ diff --git a/classautonomous_1_1AutonomousTask.html b/classautonomous_1_1AutonomousTask.html index f8112415..ff5fb0b0 100644 --- a/classautonomous_1_1AutonomousTask.html +++ b/classautonomous_1_1AutonomousTask.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): autonomous::AutonomousTask Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -106,7 +119,8 @@
+
diff --git a/classcam_1_1Camera-members.html b/classcam_1_1Camera-members.html index 3e44dca7..024ae910 100644 --- a/classcam_1_1Camera-members.html +++ b/classcam_1_1Camera-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
cam::Camera Member List
@@ -111,7 +124,8 @@
+ diff --git a/classcam_1_1Camera.html b/classcam_1_1Camera.html index 90935bf9..6513ed72 100644 --- a/classcam_1_1Camera.html +++ b/classcam_1_1Camera.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): cam::Camera Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -177,7 +190,7 @@

cam::Camera::Camera ( - ) + ) @@ -197,27 +210,27 @@

cam::Camera::Camera ( - std::string filename, + std::string filename, - std::string name, + std::string name, - std::string description = "", + std::string description = "", - CameraParams intrinsic_params = CameraParams(), + CameraParams intrinsic_params = CameraParams(), - cv::Mat extrinsic_params = cv::Mat() ) + cv::Mat extrinsic_params = cv::Mat() )

@@ -243,27 +256,27 @@

cam::Camera::Camera ( - int camera_id, + int camera_id, - std::string name, + std::string name, - std::string description = "", + std::string description = "", - CameraParams intrinsic_params = CameraParams(), + CameraParams intrinsic_params = CameraParams(), - cv::Mat extrinsic_params = cv::Mat() ) + cv::Mat extrinsic_params = cv::Mat() )

@@ -310,7 +323,7 @@

std::string cam::Camera::getDescription ( - ) + ) const @@ -356,7 +369,7 @@

bool cam::Camera::next ( - cv::Mat & frame, + cv::Mat & frame, @@ -387,12 +400,12 @@

bool cam::Camera::next ( - cv::Mat & frame, + cv::Mat & frame, - uint32_t & frame_num, + uint32_t & frame_num, @@ -424,17 +437,17 @@

bool cam::Camera::open ( - int camera_id, + int camera_id, - CameraParams intrinsic_params = CameraParams(), + CameraParams intrinsic_params = CameraParams(), - cv::Mat extrinsic_params = cv::Mat() ) + cv::Mat extrinsic_params = cv::Mat() )

@@ -454,17 +467,17 @@

bool cam::Camera::open ( - std::string filename, + std::string filename, - CameraParams intrinsic_params = CameraParams(), + CameraParams intrinsic_params = CameraParams(), - cv::Mat extrinsic_params = cv::Mat() ) + cv::Mat extrinsic_params = cv::Mat() )

@@ -564,7 +577,8 @@

+

diff --git a/classcam_1_1CameraParams-members.html b/classcam_1_1CameraParams-members.html index 1fefc581..63ce5f9b 100644 --- a/classcam_1_1CameraParams-members.html +++ b/classcam_1_1CameraParams-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
cam::CameraParams Member List
@@ -103,7 +116,8 @@
+ diff --git a/classcam_1_1CameraParams.html b/classcam_1_1CameraParams.html index 246d2dc3..c71adb36 100644 --- a/classcam_1_1CameraParams.html +++ b/classcam_1_1CameraParams.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): cam::CameraParams Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -151,7 +164,7 @@

cam::CameraParams::CameraParams ( - ) + ) @@ -171,17 +184,17 @@

cam::CameraParams::CameraParams ( - const cv::Mat & camera_matrix, + const cv::Mat & camera_matrix, - const cv::Mat & dist_coeff, + const cv::Mat & dist_coeff, - cv::Size image_size = cv::Size(640, 480) ) + cv::Size image_size = cv::Size(640, 480) )

@@ -266,7 +279,8 @@

+

diff --git a/classcam_1_1invalid__camera__config-members.html b/classcam_1_1invalid__camera__config-members.html index a046a1d5..41ada2db 100644 --- a/classcam_1_1invalid__camera__config-members.html +++ b/classcam_1_1invalid__camera__config-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
cam::invalid_camera_config Member List
@@ -95,7 +108,8 @@
+ diff --git a/classcam_1_1invalid__camera__config.html b/classcam_1_1invalid__camera__config.html index 91ede139..292dca89 100644 --- a/classcam_1_1invalid__camera__config.html +++ b/classcam_1_1invalid__camera__config.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): cam::invalid_camera_config Class Reference + + @@ -39,23 +41,33 @@ - + + + +
diff --git a/classcommands_1_1CommandBase-members.html b/classcommands_1_1CommandBase-members.html index 53420221..994275bb 100644 --- a/classcommands_1_1CommandBase-members.html +++ b/classcommands_1_1CommandBase-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
commands::CommandBase Member List
@@ -94,7 +107,8 @@
+ diff --git a/classcommands_1_1CommandBase.html b/classcommands_1_1CommandBase.html index bab8dd0c..24402c92 100644 --- a/classcommands_1_1CommandBase.html +++ b/classcommands_1_1CommandBase.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): commands::CommandBase Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -120,7 +133,7 @@

virtual command_t commands::CommandBase::getOutput ( - ) + ) @@ -147,7 +160,7 @@

virtual bool commands::CommandBase::isDone ( - ) + ) @@ -168,7 +181,8 @@

+

diff --git a/classcommands_1_1DriveToWaypointCommand-members.html b/classcommands_1_1DriveToWaypointCommand-members.html index 117c6d63..de5a194c 100644 --- a/classcommands_1_1DriveToWaypointCommand-members.html +++ b/classcommands_1_1DriveToWaypointCommand-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
commands::DriveToWaypointCommand Member List
@@ -96,7 +109,8 @@
+ diff --git a/classcommands_1_1DriveToWaypointCommand.html b/classcommands_1_1DriveToWaypointCommand.html index daeec12c..73b57a45 100644 --- a/classcommands_1_1DriveToWaypointCommand.html +++ b/classcommands_1_1DriveToWaypointCommand.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): commands::DriveToWaypointCommand Class Reference + + @@ -39,23 +41,33 @@ - + + + +
diff --git a/classcontrol_1_1JacobianPosController-members.html b/classcontrol_1_1JacobianPosController-members.html index ed61b3b4..0f0df2bf 100644 --- a/classcontrol_1_1JacobianPosController-members.html +++ b/classcontrol_1_1JacobianPosController-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
control::JacobianPosController< outputDim, inputDim > Member List
@@ -98,7 +111,8 @@
+ diff --git a/classcontrol_1_1JacobianPosController.html b/classcontrol_1_1JacobianPosController.html index 742fd565..99df5a21 100644 --- a/classcontrol_1_1JacobianPosController.html +++ b/classcontrol_1_1JacobianPosController.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): control::JacobianPosController< outputDim, inputDim > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -144,17 +157,17 @@

control::JacobianPosController< outputDim, inputDim >::JacobianPosController ( - const std::function< navtypes::Vectord< outputDim >(const navtypes::Vectord< inputDim > &)> & kinematicsFunc, + const std::function< navtypes::Vectord< outputDim >(const navtypes::Vectord< inputDim > &)> & kinematicsFunc, - const std::function< navtypes::Matrixd< outputDim, inputDim >(const navtypes::Vectord< inputDim > &)> & jacobianFunc, + const std::function< navtypes::Matrixd< outputDim, inputDim >(const navtypes::Vectord< inputDim > &)> & jacobianFunc, - double maxVel, + double maxVel, @@ -197,7 +210,7 @@

navtypes::Vectord< inputDim > control::JacobianPosController< outputDim, inputDim >::getCommand ( - robot::types::datatime_t currTime, + robot::types::datatime_t currTime, @@ -238,12 +251,12 @@

navtypes::Vectord< inputDim > control::JacobianPosController< outputDim, inputDim >::getCommand ( - robot::types::datatime_t currTime, + robot::types::datatime_t currTime, - const navtypes::Vectord< inputDim > & currPos, + const navtypes::Vectord< inputDim > & currPos, @@ -285,7 +298,7 @@

bool control::JacobianPosController< outputDim, inputDim >::hasTarget ( - ) + ) const @@ -315,12 +328,12 @@

void control::JacobianPosController< outputDim, inputDim >::setTarget ( - robot::types::datatime_t currTime, + robot::types::datatime_t currTime, - const navtypes::Vectord< inputDim > & currPos, + const navtypes::Vectord< inputDim > & currPos, @@ -353,7 +366,8 @@

+

diff --git a/classcontrol_1_1PIDController-members.html b/classcontrol_1_1PIDController-members.html index 10877373..4c8693b9 100644 --- a/classcontrol_1_1PIDController-members.html +++ b/classcontrol_1_1PIDController-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
control::PIDController< dim > Member List
@@ -99,7 +112,8 @@
+ diff --git a/classcontrol_1_1PIDController.html b/classcontrol_1_1PIDController.html index 0f8a50c1..ca5927fb 100644 --- a/classcontrol_1_1PIDController.html +++ b/classcontrol_1_1PIDController.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): control::PIDController< dim > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Types | @@ -186,7 +199,7 @@

Arrayd< dim > control::PIDController< dim >::getOutput ( - robot::types::datatime_t currTime, + robot::types::datatime_t currTime, @@ -227,7 +240,7 @@

bool control::PIDController< dim >::hasTarget ( - ) + ) @@ -319,7 +332,8 @@

+

diff --git a/classcontrol_1_1PlanarArmController-members.html b/classcontrol_1_1PlanarArmController-members.html index 7a2be605..74edb575 100644 --- a/classcontrol_1_1PlanarArmController-members.html +++ b/classcontrol_1_1PlanarArmController-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
control::PlanarArmController< N > Member List
@@ -102,7 +115,8 @@
+ diff --git a/classcontrol_1_1PlanarArmController.html b/classcontrol_1_1PlanarArmController.html index f027df10..72bcc2cd 100644 --- a/classcontrol_1_1PlanarArmController.html +++ b/classcontrol_1_1PlanarArmController.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): control::PlanarArmController< N > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -157,7 +170,7 @@

control::PlanarArmController< N >::PlanarArmController ( - const kinematics::ArmKinematics< 2, N > & kin_obj, + const kinematics::ArmKinematics< 2, N > & kin_obj, @@ -270,7 +283,7 @@

navtypes::Vectord< N > control::PlanarArmController< N >::getCommand ( - robot::types::datatime_t currTime, + robot::types::datatime_t currTime, @@ -311,12 +324,12 @@

static bool control::PlanarArmController< N >::is_setpoint_valid ( - const navtypes::Vectord< N > & targetJointPos, + const navtypes::Vectord< N > & targetJointPos, - kinematics::ArmKinematics< 2, N > kin_obj, + kinematics::ArmKinematics< 2, N > kin_obj, @@ -391,12 +404,12 @@

void control::PlanarArmController< N >::set_x_vel ( - robot::types::datatime_t currTime, + robot::types::datatime_t currTime, - double targetVel, + double targetVel, @@ -438,12 +451,12 @@

void control::PlanarArmController< N >::set_y_vel ( - robot::types::datatime_t currTime, + robot::types::datatime_t currTime, - double targetVel, + double targetVel, @@ -514,7 +527,8 @@

+

diff --git a/classcontrol_1_1SingleDimTrapezoidalVelocityProfile-members.html b/classcontrol_1_1SingleDimTrapezoidalVelocityProfile-members.html index f03640cc..3bd731a0 100644 --- a/classcontrol_1_1SingleDimTrapezoidalVelocityProfile-members.html +++ b/classcontrol_1_1SingleDimTrapezoidalVelocityProfile-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
control::SingleDimTrapezoidalVelocityProfile Member List
@@ -98,7 +111,8 @@
+ diff --git a/classcontrol_1_1SingleDimTrapezoidalVelocityProfile.html b/classcontrol_1_1SingleDimTrapezoidalVelocityProfile.html index bbfc1aed..76d6cd3a 100644 --- a/classcontrol_1_1SingleDimTrapezoidalVelocityProfile.html +++ b/classcontrol_1_1SingleDimTrapezoidalVelocityProfile.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): control::SingleDimTrapezoidalVelocityProfile Class Reference + + @@ -39,23 +41,33 @@ - + + + +
diff --git a/classcontrol_1_1TrapezoidalVelocityProfile-members.html b/classcontrol_1_1TrapezoidalVelocityProfile-members.html index 74547609..e32dddbe 100644 --- a/classcontrol_1_1TrapezoidalVelocityProfile-members.html +++ b/classcontrol_1_1TrapezoidalVelocityProfile-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
control::TrapezoidalVelocityProfile< dim > Member List
@@ -99,7 +112,8 @@
+ diff --git a/classcontrol_1_1TrapezoidalVelocityProfile.html b/classcontrol_1_1TrapezoidalVelocityProfile.html index 2574268b..08984832 100644 --- a/classcontrol_1_1TrapezoidalVelocityProfile.html +++ b/classcontrol_1_1TrapezoidalVelocityProfile.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): control::TrapezoidalVelocityProfile< dim > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -145,7 +158,7 @@

control::TrapezoidalVelocityProfile< dim >::TrapezoidalVelocityProfile ( - double maxVel, + double maxVel, @@ -222,7 +235,7 @@

std::optional< util::dseconds > control::TrapezoidalVelocityProfile< dim >::getTotalTime ( - ) + ) const @@ -252,7 +265,7 @@

bool control::TrapezoidalVelocityProfile< dim >::hasTarget ( - ) + ) const @@ -282,12 +295,12 @@

void control::TrapezoidalVelocityProfile< dim >::setTarget ( - robot::types::datatime_t currTime, + robot::types::datatime_t currTime, - const navtypes::Vectord< dim > & startPos, + const navtypes::Vectord< dim > & startPos, @@ -328,12 +341,12 @@

void control::TrapezoidalVelocityProfile< dim >::setTarget ( - robot::types::datatime_t currTime, + robot::types::datatime_t currTime, - const std::array< double, dim > & startPos, + const std::array< double, dim > & startPos, @@ -366,7 +379,8 @@

+

diff --git a/classes.html b/classes.html index fe1255c8..63e343e3 100644 --- a/classes.html +++ b/classes.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Class Index + + @@ -39,24 +41,35 @@
- + +
+
+
ArduPilotProtocol (net::ardupilot)
ArmIKTask (net::mc::tasks)
ArmKinematics (kinematics)
AsyncTask (util)
AutonomousTask (autonomous)
B
-
base_motor (robot)
+
bad_datapoint_access (robot::types)
base_motor (robot)
C
Camera (cam)
CameraConfig (cam)
CameraParams (cam)
CameraStreamTask (net::mc::tasks)
can_motor (robot)
command_t (commands)
CommandBase (commands)
@@ -151,7 +164,8 @@
+
diff --git a/classfilters_1_1ExtendedKalmanFilter-members.html b/classfilters_1_1ExtendedKalmanFilter-members.html index 398e8069..e20bfcca 100644 --- a/classfilters_1_1ExtendedKalmanFilter-members.html +++ b/classfilters_1_1ExtendedKalmanFilter-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@ - + + + +
filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > Member List
@@ -97,8 +110,8 @@ KalmanFilterBase() (defined in filters::KalmanFilterBase< stateDim, inputDim >)filters::KalmanFilterBase< stateDim, inputDim >inline output_t typedef (defined in filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >)filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > outputfunc_t typedef (defined in filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >)filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > - outputFuncJacobianVfilters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > - outputFuncJacobianXfilters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > + outputFuncJacobianVfilters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > + outputFuncJacobianXfilters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > outputnoise_t typedef (defined in filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >)filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > P (defined in filters::KalmanFilterBase< stateDim, inputDim >)filters::KalmanFilterBase< stateDim, inputDim >protected predict(const Eigen::Matrix< double, inputDim, 1 > &input) overridefilters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >inlinevirtual @@ -109,13 +122,14 @@ reset(const Eigen::Matrix< double, stateDim, 1 > &state, const Eigen::Matrix< double, stateDim, stateDim > &estCovMat)filters::KalmanFilterBase< stateDim, inputDim >inline state_t typedef (defined in filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >)filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > statefunc_t typedef (defined in filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >)filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > - stateFuncJacobianWfilters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > - stateFuncJacobianXfilters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > + stateFuncJacobianWfilters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > + stateFuncJacobianXfilters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > xHat (defined in filters::KalmanFilterBase< stateDim, inputDim >)filters::KalmanFilterBase< stateDim, inputDim >protected
+ diff --git a/classfilters_1_1ExtendedKalmanFilter.html b/classfilters_1_1ExtendedKalmanFilter.html index cd18e1e7..1fed1d22 100644 --- a/classfilters_1_1ExtendedKalmanFilter.html +++ b/classfilters_1_1ExtendedKalmanFilter.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Types | @@ -111,20 +124,20 @@
Collaboration graph
- - - - - - - - - - - - - - + + + + + + + + + + + + + +
[legend]
@@ -183,18 +196,18 @@
- - - - - - - - - - - - + + + + + + + + + + + +

Public Attributes

std::function< Eigen::Matrix< double, stateDim, stateDim >(const state_t &, const input_t &, const processnoise_t &) stateFuncJacobianX )
 Set this to provide an analytic solution to df/dx.
 
std::function< Eigen::Matrix< double, stateDim, processNoiseDim >(const state_t &, const input_t &, const processnoise_t &) stateFuncJacobianW )
 Set this to provide an analytic solution to df/dw.
 
std::function< Eigen::Matrix< double, outputDim, stateDim >(const state_t &, const outputnoise_t &) outputFuncJacobianX )
 Set this to provide an analytic solution to dh/dx.
 
std::function< Eigen::Matrix< double, outputDim, outputNoiseDim >(const state_t &, const outputnoise_t &) outputFuncJacobianV )
 Set this to provide an analytic solution to dh/dv.
 
std::function< Eigen::Matrix< double, stateDim, stateDim >(const state_t &, const input_t &, const processnoise_t &)> stateFuncJacobianX
 Set this to provide an analytic solution to df/dx.
 
std::function< Eigen::Matrix< double, stateDim, processNoiseDim >(const state_t &, const input_t &, const processnoise_t &)> stateFuncJacobianW
 Set this to provide an analytic solution to df/dw.
 
std::function< Eigen::Matrix< double, outputDim, stateDim >(const state_t &, const outputnoise_t &)> outputFuncJacobianX
 Set this to provide an analytic solution to dh/dx.
 
std::function< Eigen::Matrix< double, outputDim, outputNoiseDim >(const state_t &, const outputnoise_t &)> outputFuncJacobianV
 Set this to provide an analytic solution to dh/dv.
 
@@ -273,22 +286,22 @@

filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >::ExtendedKalmanFilter

- + - + - + - + @@ -392,8 +405,8 @@

Member Data Documentation

- -

◆ outputFuncJacobianV

+ +

◆ outputFuncJacobianV

@@ -401,7 +414,7 @@

- +

Additional Inherited Members

(const statefunc_t & stateFunc, const statefunc_t & stateFunc,
const outputfunc_t & outputFunc, const outputfunc_t & outputFunc,
const statespace::NoiseCovMat< stateDim, processNoiseDim, inputDim > & processNoise, const statespace::NoiseCovMat< stateDim, processNoiseDim, inputDim > & processNoise,
const statespace::NoiseCovMat< stateDim, outputNoiseDim, outputDim > & outputNoise, const statespace::NoiseCovMat< stateDim, outputNoiseDim, outputDim > & outputNoise,
std::function<Eigen::Matrix<double, outputDim, outputNoiseDim>(const state_t&, const outputnoise_t&) filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >::outputFuncJacobianV) std::function<Eigen::Matrix<double, outputDim, outputNoiseDim>(const state_t&, const outputnoise_t&)> filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >::outputFuncJacobianV
@@ -411,8 +424,8 @@

-

◆ outputFuncJacobianX

+ +

◆ outputFuncJacobianX

@@ -420,7 +433,7 @@

- std::function<Eigen::Matrix<double, outputDim, stateDim>(const state_t&, const outputnoise_t&) filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >::outputFuncJacobianX) + std::function<Eigen::Matrix<double, outputDim, stateDim>(const state_t&, const outputnoise_t&)> filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >::outputFuncJacobianX

@@ -430,8 +443,8 @@

-

◆ stateFuncJacobianW

+ +

◆ stateFuncJacobianW

@@ -439,7 +452,7 @@

- std::function<Eigen::Matrix<double, stateDim, processNoiseDim>( const state_t&, const input_t&, const processnoise_t&) filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >::stateFuncJacobianW) + std::function<Eigen::Matrix<double, stateDim, processNoiseDim>( const state_t&, const input_t&, const processnoise_t&)> filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >::stateFuncJacobianW

@@ -449,8 +462,8 @@

-

◆ stateFuncJacobianX

+ +

◆ stateFuncJacobianX

@@ -458,7 +471,7 @@

- std::function<Eigen::Matrix<double, stateDim, stateDim>(const state_t&, const input_t&, const processnoise_t&) filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >::stateFuncJacobianX) + std::function<Eigen::Matrix<double, stateDim, stateDim>(const state_t&, const input_t&, const processnoise_t&)> filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >::stateFuncJacobianX

@@ -474,7 +487,8 @@

+

diff --git a/classfilters_1_1ExtendedKalmanFilter__coll__graph.map b/classfilters_1_1ExtendedKalmanFilter__coll__graph.map index 79ded3cd..40a79307 100644 --- a/classfilters_1_1ExtendedKalmanFilter__coll__graph.map +++ b/classfilters_1_1ExtendedKalmanFilter__coll__graph.map @@ -1,16 +1,16 @@ - - - - - - - - - - - - - - + + + + + + + + + + + + + + diff --git a/classfilters_1_1ExtendedKalmanFilter__coll__graph.md5 b/classfilters_1_1ExtendedKalmanFilter__coll__graph.md5 index 851bf932..a04805ba 100644 --- a/classfilters_1_1ExtendedKalmanFilter__coll__graph.md5 +++ b/classfilters_1_1ExtendedKalmanFilter__coll__graph.md5 @@ -1 +1 @@ -43d18eb59725000f86a670f2052c9d70 \ No newline at end of file +c957b04dd7c8a877c5e551c38228e9a3 \ No newline at end of file diff --git a/classfilters_1_1ExtendedKalmanFilter__coll__graph.png b/classfilters_1_1ExtendedKalmanFilter__coll__graph.png index e75c1485..ba6ede57 100644 Binary files a/classfilters_1_1ExtendedKalmanFilter__coll__graph.png and b/classfilters_1_1ExtendedKalmanFilter__coll__graph.png differ diff --git a/classfilters_1_1KalmanFilter-members.html b/classfilters_1_1KalmanFilter-members.html index b36457f9..17c70a0a 100644 --- a/classfilters_1_1KalmanFilter-members.html +++ b/classfilters_1_1KalmanFilter-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +

+
filters::KalmanFilter< stateDim, inputDim, outputDim > Member List
@@ -105,7 +118,8 @@
+
diff --git a/classfilters_1_1KalmanFilter.html b/classfilters_1_1KalmanFilter.html index 7debf99b..78c142ed 100644 --- a/classfilters_1_1KalmanFilter.html +++ b/classfilters_1_1KalmanFilter.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): filters::KalmanFilter< stateDim, inputDim, outputDim > Class Template Reference + + @@ -39,23 +41,33 @@

- + + +
+
Public Member Functions | @@ -110,20 +123,20 @@
Collaboration graph
- - - - - - - - - - - - - - + + + + + + + + + + + + + +
[legend]
@@ -237,27 +250,27 @@

static KalmanFilter filters::KalmanFilter< stateDim, inputDim, outputDim >::createContinuous

- + - + - + - + - + @@ -303,27 +316,27 @@

static KalmanFilter filters::KalmanFilter< stateDim, inputDim, outputDim >::createDiscrete

- + - + - + - + - + @@ -398,7 +411,8 @@

+ diff --git a/classfilters_1_1KalmanFilterBase-members.html b/classfilters_1_1KalmanFilterBase-members.html index b9be382c..0740cb13 100644 --- a/classfilters_1_1KalmanFilterBase-members.html +++ b/classfilters_1_1KalmanFilterBase-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@

(const Eigen::Matrix< double, stateDim, stateDim > & systemMat, const Eigen::Matrix< double, stateDim, stateDim > & systemMat,
const Eigen::Matrix< double, stateDim, inputDim > & inputMat, const Eigen::Matrix< double, stateDim, inputDim > & inputMat,
const Eigen::Matrix< double, outputDim, stateDim > & outputMat, const Eigen::Matrix< double, outputDim, stateDim > & outputMat,
const Eigen::Matrix< double, stateDim, 1 > & stateStdDevs, const Eigen::Matrix< double, stateDim, 1 > & stateStdDevs,
const Eigen::Matrix< double, outputDim, 1 > & measurementStdDevs, const Eigen::Matrix< double, outputDim, 1 > & measurementStdDevs,
(const Eigen::Matrix< double, stateDim, stateDim > & systemMat, const Eigen::Matrix< double, stateDim, stateDim > & systemMat,
const Eigen::Matrix< double, stateDim, inputDim > & inputMat, const Eigen::Matrix< double, stateDim, inputDim > & inputMat,
const Eigen::Matrix< double, outputDim, stateDim > & outputMat, const Eigen::Matrix< double, outputDim, stateDim > & outputMat,
const Eigen::Matrix< double, stateDim, 1 > & stateStdDevs, const Eigen::Matrix< double, stateDim, 1 > & stateStdDevs,
const Eigen::Matrix< double, outputDim, 1 > & measurementStdDevs, const Eigen::Matrix< double, outputDim, 1 > & measurementStdDevs,
- + + +
+
filters::KalmanFilterBase< stateDim, inputDim > Member List
@@ -102,7 +115,8 @@
+
diff --git a/classfilters_1_1KalmanFilterBase.html b/classfilters_1_1KalmanFilterBase.html index adc293ec..4d20a139 100644 --- a/classfilters_1_1KalmanFilterBase.html +++ b/classfilters_1_1KalmanFilterBase.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): filters::KalmanFilterBase< stateDim, inputDim > Class Template Reference + + @@ -39,23 +41,33 @@
- + + +
+
Public Member Functions | @@ -114,18 +127,18 @@
Collaboration graph
- - - - - - - - - - - - + + + + + + + + + + + +
[legend]
@@ -187,7 +200,7 @@

Eigen::Matrix< double, stateDim, stateDim > filters::KalmanFilterBase< stateDim, inputDim >::getEstimateCovarianceMat

- +
()) const
@@ -218,7 +231,7 @@

Eigen::Matrix< double, stateDim, 1 > filters::KalmanFilterBase< stateDim, inputDim >::getState ( - ) + ) const @@ -285,7 +298,7 @@

void filters::KalmanFilterBase< stateDim, inputDim >::reset ( - ) + ) @@ -351,7 +364,7 @@

void filters::KalmanFilterBase< stateDim, inputDim >::reset ( - const Eigen::Matrix< double, stateDim, 1 > & state, + const Eigen::Matrix< double, stateDim, 1 > & state, @@ -392,7 +405,7 @@

void filters::KalmanFilterBase< stateDim, inputDim >::reset ( - const Eigen::Matrix< double, stateDim, 1 > & state, + const Eigen::Matrix< double, stateDim, 1 > & state, @@ -425,7 +438,8 @@

+

diff --git a/classfilters_1_1KalmanFilterBase__coll__graph.map b/classfilters_1_1KalmanFilterBase__coll__graph.map index 6ef40efc..bff55cba 100644 --- a/classfilters_1_1KalmanFilterBase__coll__graph.map +++ b/classfilters_1_1KalmanFilterBase__coll__graph.map @@ -1,14 +1,14 @@ - - - - - - - - - - - - + + + + + + + + + + + + diff --git a/classfilters_1_1KalmanFilterBase__coll__graph.md5 b/classfilters_1_1KalmanFilterBase__coll__graph.md5 index cd336edb..3638b383 100644 --- a/classfilters_1_1KalmanFilterBase__coll__graph.md5 +++ b/classfilters_1_1KalmanFilterBase__coll__graph.md5 @@ -1 +1 @@ -ac50ec56b5150a78655b216981af5ce0 \ No newline at end of file +4ce1ebaa6536433d5573e48499f768bc \ No newline at end of file diff --git a/classfilters_1_1KalmanFilterBase__coll__graph.png b/classfilters_1_1KalmanFilterBase__coll__graph.png index f4a9c273..64caaf2a 100644 Binary files a/classfilters_1_1KalmanFilterBase__coll__graph.png and b/classfilters_1_1KalmanFilterBase__coll__graph.png differ diff --git a/classfilters_1_1KalmanFilter__coll__graph.map b/classfilters_1_1KalmanFilter__coll__graph.map index 4a470e4d..bb76a56c 100644 --- a/classfilters_1_1KalmanFilter__coll__graph.map +++ b/classfilters_1_1KalmanFilter__coll__graph.map @@ -1,16 +1,16 @@ - - - - - - - - - - - - - - + + + + + + + + + + + + + + diff --git a/classfilters_1_1KalmanFilter__coll__graph.md5 b/classfilters_1_1KalmanFilter__coll__graph.md5 index 1448e690..d5542ea1 100644 --- a/classfilters_1_1KalmanFilter__coll__graph.md5 +++ b/classfilters_1_1KalmanFilter__coll__graph.md5 @@ -1 +1 @@ -4188a34b861a1f3202a19bec298f81a2 \ No newline at end of file +c44fd7781d5f4cdef5dd351857d2d01c \ No newline at end of file diff --git a/classfilters_1_1KalmanFilter__coll__graph.png b/classfilters_1_1KalmanFilter__coll__graph.png index 420882a9..ac4fc734 100644 Binary files a/classfilters_1_1KalmanFilter__coll__graph.png and b/classfilters_1_1KalmanFilter__coll__graph.png differ diff --git a/classfilters_1_1MultiSensorEKF-members.html b/classfilters_1_1MultiSensorEKF-members.html index 1be124e0..5367a817 100644 --- a/classfilters_1_1MultiSensorEKF-members.html +++ b/classfilters_1_1MultiSensorEKF-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
filters::MultiSensorEKF< stateDim, inputDim, processNoiseDim, numOutputs > Member List
@@ -114,7 +127,8 @@
+
diff --git a/classfilters_1_1MultiSensorEKF.html b/classfilters_1_1MultiSensorEKF.html index a3c7fe8c..d26f5fc2 100644 --- a/classfilters_1_1MultiSensorEKF.html +++ b/classfilters_1_1MultiSensorEKF.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): filters::MultiSensorEKF< stateDim, inputDim, processNoiseDim, numOutputs > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Types | @@ -105,20 +118,20 @@
Collaboration graph
- - - - - - - - - - - - - - + + + + + + + + + + + + + +
[legend]
@@ -221,7 +234,8 @@

+ diff --git a/classfilters_1_1MultiSensorEKF__coll__graph.map b/classfilters_1_1MultiSensorEKF__coll__graph.map index 1d023dc6..a96c7da7 100644 --- a/classfilters_1_1MultiSensorEKF__coll__graph.map +++ b/classfilters_1_1MultiSensorEKF__coll__graph.map @@ -1,16 +1,16 @@ - - - - - - - - - - - - - - + + + + + + + + + + + + + + diff --git a/classfilters_1_1MultiSensorEKF__coll__graph.md5 b/classfilters_1_1MultiSensorEKF__coll__graph.md5 index 5ab21430..55af60f9 100644 --- a/classfilters_1_1MultiSensorEKF__coll__graph.md5 +++ b/classfilters_1_1MultiSensorEKF__coll__graph.md5 @@ -1 +1 @@ -0ea6f0e74d6a20c5e65280d30115ba5b \ No newline at end of file +78a0f27c4cd1cea9e4e1099804976069 \ No newline at end of file diff --git a/classfilters_1_1MultiSensorEKF__coll__graph.png b/classfilters_1_1MultiSensorEKF__coll__graph.png index 8559f192..c31c92ca 100644 Binary files a/classfilters_1_1MultiSensorEKF__coll__graph.png and b/classfilters_1_1MultiSensorEKF__coll__graph.png differ diff --git a/classfilters_1_1Output-members.html b/classfilters_1_1Output-members.html index fe44664b..df84a095 100644 --- a/classfilters_1_1Output-members.html +++ b/classfilters_1_1Output-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@

- + + +
+
filters::Output Member List
@@ -104,7 +117,8 @@
+
diff --git a/classfilters_1_1Output.html b/classfilters_1_1Output.html index 0c6b64cb..0745c025 100644 --- a/classfilters_1_1Output.html +++ b/classfilters_1_1Output.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): filters::Output Class Reference + + @@ -39,23 +41,33 @@ - + + + +
diff --git a/classfilters_1_1RollingAvgFilter-members.html b/classfilters_1_1RollingAvgFilter-members.html index 0f86ff46..b6fa9649 100644 --- a/classfilters_1_1RollingAvgFilter-members.html +++ b/classfilters_1_1RollingAvgFilter-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
filters::RollingAvgFilter< T > Member List
@@ -99,7 +112,8 @@
+ diff --git a/classfilters_1_1RollingAvgFilter.html b/classfilters_1_1RollingAvgFilter.html index f3b90788..d6d3b09f 100644 --- a/classfilters_1_1RollingAvgFilter.html +++ b/classfilters_1_1RollingAvgFilter.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): filters::RollingAvgFilter< T > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -180,7 +193,7 @@

T filters::RollingAvgFilter< T >::get ( - ) + ) const @@ -248,7 +261,7 @@

int filters::RollingAvgFilter< T >::getBufferSize ( - ) + ) const @@ -278,7 +291,7 @@

std::list< T > filters::RollingAvgFilter< T >::getData ( - ) + ) const @@ -308,7 +321,7 @@

int filters::RollingAvgFilter< T >::getSize ( - ) + ) const @@ -330,7 +343,8 @@

+

diff --git a/classfilters_1_1statespace_1_1NoiseCovMat-members.html b/classfilters_1_1statespace_1_1NoiseCovMat-members.html index 567cea1e..c41b94a5 100644 --- a/classfilters_1_1statespace_1_1NoiseCovMat-members.html +++ b/classfilters_1_1statespace_1_1NoiseCovMat-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
filters::statespace::NoiseCovMat< stateDim, size, paramSize > Member List
@@ -98,7 +111,8 @@
+ diff --git a/classfilters_1_1statespace_1_1NoiseCovMat.html b/classfilters_1_1statespace_1_1NoiseCovMat.html index b2ffefa5..a03f5d09 100644 --- a/classfilters_1_1statespace_1_1NoiseCovMat.html +++ b/classfilters_1_1statespace_1_1NoiseCovMat.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): filters::statespace::NoiseCovMat< stateDim, size, paramSize > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Types | @@ -254,7 +267,7 @@

Eigen::MatrixXd filters::statespace::NoiseCovMat< stateDim, size, paramSize >::get ( - const state_t & x, + const state_t & x, @@ -289,7 +302,8 @@

+

diff --git a/classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4-members.html b/classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4-members.html index 143380b6..9fef252f 100644 --- a/classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4-members.html +++ b/classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
filters::statespace::NoiseCovMat<-1, -1, -1 > Member List
@@ -99,7 +112,8 @@
+ diff --git a/classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4.html b/classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4.html index 9b40383d..53f31087 100644 --- a/classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4.html +++ b/classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): filters::statespace::NoiseCovMat<-1, -1, -1 > Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -137,12 +150,12 @@

filters::statespace::NoiseCovMat<-1, -1, -1 >::NoiseCovMat ( - const Eigen::VectorXd & stdDevs, + const Eigen::VectorXd & stdDevs, - int stateDim, + int stateDim, @@ -171,12 +184,12 @@

filters::statespace::NoiseCovMat<-1, -1, -1 >::NoiseCovMat ( - const Eigen::MatrixXd & mat, + const Eigen::MatrixXd & mat, - int stateDim, + int stateDim, @@ -205,17 +218,17 @@

filters::statespace::NoiseCovMat<-1, -1, -1 >::NoiseCovMat ( - const std::function< Eigen::MatrixXd(const Eigen::VectorXd &, const Eigen::VectorXd &)> & func, + const std::function< Eigen::MatrixXd(const Eigen::VectorXd &, const Eigen::VectorXd &)> & func, - int stateDim, + int stateDim, - int size, + int size, @@ -246,7 +259,7 @@

Eigen::MatrixXd filters::statespace::NoiseCovMat<-1, -1, -1 >::get ( - const Eigen::VectorXd & x, + const Eigen::VectorXd & x, @@ -275,7 +288,8 @@

+

diff --git a/classh264encoder_1_1Encoder-members.html b/classh264encoder_1_1Encoder-members.html index 160d6323..d582fb3d 100644 --- a/classh264encoder_1_1Encoder-members.html +++ b/classh264encoder_1_1Encoder-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
h264encoder::Encoder Member List
@@ -96,7 +109,8 @@
+ diff --git a/classh264encoder_1_1Encoder.html b/classh264encoder_1_1Encoder.html index 5561db81..f2c8ece9 100644 --- a/classh264encoder_1_1Encoder.html +++ b/classh264encoder_1_1Encoder.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): h264encoder::Encoder Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -109,7 +122,8 @@
+
diff --git a/classh264encoder_1_1EncoderImpl-members.html b/classh264encoder_1_1EncoderImpl-members.html index 070d636d..00f67634 100644 --- a/classh264encoder_1_1EncoderImpl-members.html +++ b/classh264encoder_1_1EncoderImpl-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
h264encoder::EncoderImpl Member List
@@ -98,7 +111,8 @@
+ diff --git a/classh264encoder_1_1EncoderImpl.html b/classh264encoder_1_1EncoderImpl.html index de759572..853ec548 100644 --- a/classh264encoder_1_1EncoderImpl.html +++ b/classh264encoder_1_1EncoderImpl.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): h264encoder::EncoderImpl Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -127,7 +140,8 @@
+
diff --git a/classkinematics_1_1ArmKinematics-members.html b/classkinematics_1_1ArmKinematics-members.html index 3bfc7db2..cb902c26 100644 --- a/classkinematics_1_1ArmKinematics-members.html +++ b/classkinematics_1_1ArmKinematics-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
kinematics::ArmKinematics< D, N > Member List
@@ -108,7 +121,8 @@
+ diff --git a/classkinematics_1_1ArmKinematics.html b/classkinematics_1_1ArmKinematics.html index 29fcd2ec..648623eb 100644 --- a/classkinematics_1_1ArmKinematics.html +++ b/classkinematics_1_1ArmKinematics.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): kinematics::ArmKinematics< D, N > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -240,7 +253,7 @@

navtypes::Vectord< N > kinematics::ArmKinematics< D, N >::getSegLens ( - ) + ) const @@ -348,12 +361,12 @@

navtypes::Vectord< N > kinematics::ArmKinematics< D, N >::solve ( - const navtypes::Vectord< D > & eePos, + const navtypes::Vectord< D > & eePos, - const navtypes::Vectord< N > & jointAngles, + const navtypes::Vectord< N > & jointAngles, @@ -390,7 +403,8 @@

+

diff --git a/classkinematics_1_1DiffDriveKinematics-members.html b/classkinematics_1_1DiffDriveKinematics-members.html index b493956d..f73673f9 100644 --- a/classkinematics_1_1DiffDriveKinematics-members.html +++ b/classkinematics_1_1DiffDriveKinematics-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
kinematics::DiffDriveKinematics Member List
@@ -100,7 +113,8 @@
+ diff --git a/classkinematics_1_1DiffDriveKinematics.html b/classkinematics_1_1DiffDriveKinematics.html index 5d307245..07b266a5 100644 --- a/classkinematics_1_1DiffDriveKinematics.html +++ b/classkinematics_1_1DiffDriveKinematics.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): kinematics::DiffDriveKinematics Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Types | @@ -204,17 +217,17 @@

pose_t kinematics::DiffDriveKinematics::ensureWithinWheelSpeedLimit ( - PreferredVelPreservation preferred, + PreferredVelPreservation preferred, - double xVel, + double xVel, - double thetaVel, + double thetaVel, @@ -247,7 +260,7 @@

pose_t kinematics::DiffDriveKinematics::getLocalPoseUpdate ( - const wheelvel_t & wheelVel, + const wheelvel_t & wheelVel, @@ -278,12 +291,12 @@

pose_t kinematics::DiffDriveKinematics::getNextPose ( - const wheelvel_t & wheelVel, + const wheelvel_t & wheelVel, - const navtypes::pose_t & pose, + const navtypes::pose_t & pose, @@ -316,12 +329,12 @@

pose_t kinematics::DiffDriveKinematics::getPoseUpdate ( - const wheelvel_t & wheelVel, + const wheelvel_t & wheelVel, - double heading, + double heading, @@ -352,7 +365,7 @@

wheelvel_t kinematics::DiffDriveKinematics::robotVelToWheelVel ( - double xVel, + double xVel, @@ -383,7 +396,7 @@

pose_t kinematics::DiffDriveKinematics::wheelVelToRobotVel ( - double lVel, + double lVel, @@ -413,7 +426,8 @@

+

diff --git a/classkinematics_1_1DiffWristKinematics-members.html b/classkinematics_1_1DiffWristKinematics-members.html index 356e5c7f..fba5bf9c 100644 --- a/classkinematics_1_1DiffWristKinematics-members.html +++ b/classkinematics_1_1DiffWristKinematics-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
kinematics::DiffWristKinematics Member List
@@ -96,7 +109,8 @@
+ diff --git a/classkinematics_1_1DiffWristKinematics.html b/classkinematics_1_1DiffWristKinematics.html index 98436d46..9dff1670 100644 --- a/classkinematics_1_1DiffWristKinematics.html +++ b/classkinematics_1_1DiffWristKinematics.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): kinematics::DiffWristKinematics Class Reference + + @@ -39,23 +41,33 @@ - + + + +
@@ -178,7 +191,8 @@

+

diff --git a/classkinematics_1_1FabrikSolver2D-members.html b/classkinematics_1_1FabrikSolver2D-members.html index 7aea7691..92f4e040 100644 --- a/classkinematics_1_1FabrikSolver2D-members.html +++ b/classkinematics_1_1FabrikSolver2D-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
kinematics::FabrikSolver2D< N > Member List
@@ -94,11 +107,12 @@ FabrikSolver2D(std::shared_ptr< const PlanarArmFK< N > > fk, double thresh, int maxIter)kinematics::FabrikSolver2D< N >inline InverseArmKinematics(std::shared_ptr< const ForwardArmKinematics< D, N > > fk)kinematics::InverseArmKinematics< 2, N >inline solve(const Eigen::Vector2d &eePos, const navtypes::Vectord< N > &jointAngles, bool &success) const override (defined in kinematics::FabrikSolver2D< N >)kinematics::FabrikSolver2D< N >inline - InverseArmKinematics< 2, N >::solve(const navtypes::Vectord< D > &eePos, const navtypes::Vectord< N > &jointAngles, bool &success) const=0kinematics::InverseArmKinematics< 2, N >protectedpure virtual + kinematics::InverseArmKinematics< 2, N >::solve(const navtypes::Vectord< D > &eePos, const navtypes::Vectord< N > &jointAngles, bool &success) const=0kinematics::InverseArmKinematics< 2, N >protectedpure virtual
+ diff --git a/classkinematics_1_1FabrikSolver2D.html b/classkinematics_1_1FabrikSolver2D.html index b6304eb8..31cd7b6d 100644 --- a/classkinematics_1_1FabrikSolver2D.html +++ b/classkinematics_1_1FabrikSolver2D.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): kinematics::FabrikSolver2D< N > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -173,12 +186,12 @@

kinematics::FabrikSolver2D< N >::FabrikSolver2D ( - std::shared_ptr< const PlanarArmFK< N > > fk, + std::shared_ptr< const PlanarArmFK< N > > fk, - double thresh, + double thresh, @@ -211,7 +224,8 @@

+

diff --git a/classkinematics_1_1ForwardArmKinematics-members.html b/classkinematics_1_1ForwardArmKinematics-members.html index 49e1d6fe..66638f85 100644 --- a/classkinematics_1_1ForwardArmKinematics-members.html +++ b/classkinematics_1_1ForwardArmKinematics-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
kinematics::ForwardArmKinematics< D, N > Member List
@@ -101,7 +114,8 @@
+ diff --git a/classkinematics_1_1ForwardArmKinematics.html b/classkinematics_1_1ForwardArmKinematics.html index 78d97bea..170d2e7e 100644 --- a/classkinematics_1_1ForwardArmKinematics.html +++ b/classkinematics_1_1ForwardArmKinematics.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): kinematics::ForwardArmKinematics< D, N > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
diff --git a/classkinematics_1_1InverseArmKinematics-members.html b/classkinematics_1_1InverseArmKinematics-members.html index f91c5255..211cdd64 100644 --- a/classkinematics_1_1InverseArmKinematics-members.html +++ b/classkinematics_1_1InverseArmKinematics-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
kinematics::InverseArmKinematics< D, N > Member List
@@ -98,7 +111,8 @@
+ diff --git a/classkinematics_1_1InverseArmKinematics.html b/classkinematics_1_1InverseArmKinematics.html index 097aee85..74c76c65 100644 --- a/classkinematics_1_1InverseArmKinematics.html +++ b/classkinematics_1_1InverseArmKinematics.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): kinematics::InverseArmKinematics< D, N > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -204,7 +217,7 @@

navtypes::Vectord< N > kinematics::InverseArmKinematics< D, N >::eePosToJointPos ( - const navtypes::Vectord< D > & eePos, + const navtypes::Vectord< D > & eePos, @@ -246,12 +259,12 @@

virtual navtypes::Vectord< N > kinematics::InverseArmKinematics< D, N >::eePosToJointPos ( - const navtypes::Vectord< D > & eePos, + const navtypes::Vectord< D > & eePos, - const navtypes::Vectord< N > & jointAngles, + const navtypes::Vectord< N > & jointAngles, @@ -293,12 +306,12 @@

virtual navtypes::Vectord< N > kinematics::InverseArmKinematics< D, N >::solve ( - const navtypes::Vectord< D > & eePos, + const navtypes::Vectord< D > & eePos, - const navtypes::Vectord< N > & jointAngles, + const navtypes::Vectord< N > & jointAngles, @@ -335,7 +348,8 @@

+

diff --git a/classkinematics_1_1PlanarArmFK-members.html b/classkinematics_1_1PlanarArmFK-members.html index 1443bc03..6739c35e 100644 --- a/classkinematics_1_1PlanarArmFK-members.html +++ b/classkinematics_1_1PlanarArmFK-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
kinematics::PlanarArmFK< N > Member List
@@ -101,7 +114,8 @@
+ diff --git a/classkinematics_1_1PlanarArmFK.html b/classkinematics_1_1PlanarArmFK.html index d7275a98..cba34f0c 100644 --- a/classkinematics_1_1PlanarArmFK.html +++ b/classkinematics_1_1PlanarArmFK.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): kinematics::PlanarArmFK< N > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -170,12 +183,12 @@

kinematics::PlanarArmFK< N >::PlanarArmFK ( - const navtypes::Vectord< N > & segLens, + const navtypes::Vectord< N > & segLens, - const navtypes::Vectord< N > & jointMin, + const navtypes::Vectord< N > & jointMin, @@ -256,7 +269,7 @@

navtypes::Vectord< N > kinematics::PlanarArmFK< N >::getSegLens ( - ) + ) const @@ -356,7 +369,8 @@

+

diff --git a/classkinematics_1_1SwerveDriveKinematics-members.html b/classkinematics_1_1SwerveDriveKinematics-members.html index de48488e..7cc8f18b 100644 --- a/classkinematics_1_1SwerveDriveKinematics-members.html +++ b/classkinematics_1_1SwerveDriveKinematics-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
kinematics::SwerveDriveKinematics Member List
@@ -98,7 +111,8 @@
+ diff --git a/classkinematics_1_1SwerveDriveKinematics.html b/classkinematics_1_1SwerveDriveKinematics.html index d506aa13..9ef5f364 100644 --- a/classkinematics_1_1SwerveDriveKinematics.html +++ b/classkinematics_1_1SwerveDriveKinematics.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): kinematics::SwerveDriveKinematics Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -131,7 +144,7 @@

kinematics::SwerveDriveKinematics::SwerveDriveKinematics ( - double baseWidth, + double baseWidth, @@ -167,7 +180,7 @@

pose_t kinematics::SwerveDriveKinematics::getLocalPoseUpdate ( - const swervewheelvel_t & wheelVel, + const swervewheelvel_t & wheelVel, @@ -198,12 +211,12 @@

pose_t kinematics::SwerveDriveKinematics::getNextPose ( - const swervewheelvel_t & wheelVel, + const swervewheelvel_t & wheelVel, - const navtypes::pose_t & pose, + const navtypes::pose_t & pose, @@ -236,12 +249,12 @@

pose_t kinematics::SwerveDriveKinematics::getPoseUpdate ( - const swervewheelvel_t & wheelVel, + const swervewheelvel_t & wheelVel, - double heading, + double heading, @@ -273,12 +286,12 @@

swervewheelvel_t kinematics::SwerveDriveKinematics::robotVelToWheelVel ( - double xVel, + double xVel, - double yVel, + double yVel, @@ -334,7 +347,8 @@

+

diff --git a/classnet_1_1ardupilot_1_1ArduPilotProtocol-members.html b/classnet_1_1ardupilot_1_1ArduPilotProtocol-members.html index d9c2ae7d..4fcbb350 100644 --- a/classnet_1_1ardupilot_1_1ArduPilotProtocol-members.html +++ b/classnet_1_1ardupilot_1_1ArduPilotProtocol-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
net::ardupilot::ArduPilotProtocol Member List
@@ -98,7 +111,8 @@
+ diff --git a/classnet_1_1ardupilot_1_1ArduPilotProtocol.html b/classnet_1_1ardupilot_1_1ArduPilotProtocol.html index 8b9ff0aa..cacfdc56 100644 --- a/classnet_1_1ardupilot_1_1ArduPilotProtocol.html +++ b/classnet_1_1ardupilot_1_1ArduPilotProtocol.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): net::ardupilot::ArduPilotProtocol Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -115,7 +128,8 @@
+
diff --git a/classnet_1_1mc_1_1MissionControlProtocol-members.html b/classnet_1_1mc_1_1MissionControlProtocol-members.html index db0615fb..6f032df6 100644 --- a/classnet_1_1mc_1_1MissionControlProtocol-members.html +++ b/classnet_1_1mc_1_1MissionControlProtocol-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
net::mc::MissionControlProtocol Member List
@@ -106,7 +119,8 @@
+ diff --git a/classnet_1_1mc_1_1MissionControlProtocol.html b/classnet_1_1mc_1_1MissionControlProtocol.html index 3b4a66a9..44f71c37 100644 --- a/classnet_1_1mc_1_1MissionControlProtocol.html +++ b/classnet_1_1mc_1_1MissionControlProtocol.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): net::mc::MissionControlProtocol Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -157,7 +170,8 @@
+
diff --git a/classnet_1_1mc_1_1tasks_1_1ArmIKTask-members.html b/classnet_1_1mc_1_1tasks_1_1ArmIKTask-members.html index 658a0f1c..30590755 100644 --- a/classnet_1_1mc_1_1tasks_1_1ArmIKTask-members.html +++ b/classnet_1_1mc_1_1tasks_1_1ArmIKTask-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
net::mc::tasks::ArmIKTask Member List
@@ -90,24 +103,22 @@

This is the complete list of members for net::mc::tasks::ArmIKTask, including all inherited members.

- - - - - - + + + + - - + + - - - - + + +
ArmIKTask(websocket::SingleClientWSServer &server) (defined in net::mc::tasks::ArmIKTask)net::mc::tasks::ArmIKTask
AsyncTask(const std::optional< std::string > &name=std::nullopt)util::AsyncTask< Clock >inline
AsyncTask(const AsyncTask &)=delete (defined in util::AsyncTask< Clock >)util::AsyncTask< Clock >
isRunning()util::AsyncTask< Clock >inline
isRunningInternal()util::AsyncTask< Clock >inlineprotected
notify() overrideutil::PeriodicTask< Clock >inlineprotectedvirtual
operator=(const AsyncTask &)=delete (defined in util::AsyncTask< Clock >)util::AsyncTask< Clock >
AsyncTask(const std::optional< std::string > &name=std::nullopt)util::AsyncTask< std::chrono::steady_clock >inline
isRunning()util::AsyncTask< std::chrono::steady_clock >inline
isRunningInternal()util::AsyncTask< std::chrono::steady_clock >inlineprotected
notify() overrideutil::PeriodicTask< Clock >inlineprotectedvirtual
PeriodicTask(const std::chrono::milliseconds &period, const std::function< void()> &f)util::PeriodicTask< Clock >inline
start()util::AsyncTask< Clock >inlinevirtual
stop()util::AsyncTask< Clock >inlinevirtual
start()util::AsyncTask< std::chrono::steady_clock >inlinevirtual
stop()util::AsyncTask< std::chrono::steady_clock >inlinevirtual
task(std::unique_lock< std::mutex > &lock) overrideutil::PeriodicTask< Clock >inlineprotectedvirtual
wait_for(std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)util::AsyncTask< Clock >inlineprotected
wait_until(std::unique_lock< std::mutex > &lock, const std::chrono::time_point< Clock > &tp)util::AsyncTask< Clock >inlineprotected
wait_until_done(std::unique_lock< std::mutex > &lock)util::AsyncTask< Clock >inlineprotected
~AsyncTask() (defined in util::AsyncTask< Clock >)util::AsyncTask< Clock >inlinevirtual
wait_for(std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)util::AsyncTask< std::chrono::steady_clock >inlineprotected
wait_until(std::unique_lock< std::mutex > &lock, const std::chrono::time_point< std::chrono::steady_clock > &tp)util::AsyncTask< std::chrono::steady_clock >inlineprotected
wait_until_done(std::unique_lock< std::mutex > &lock)util::AsyncTask< std::chrono::steady_clock >inlineprotected
+ diff --git a/classnet_1_1mc_1_1tasks_1_1ArmIKTask.html b/classnet_1_1mc_1_1tasks_1_1ArmIKTask.html index f45503fa..b3b79191 100644 --- a/classnet_1_1mc_1_1tasks_1_1ArmIKTask.html +++ b/classnet_1_1mc_1_1tasks_1_1ArmIKTask.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): net::mc::tasks::ArmIKTask Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -99,14 +112,14 @@
Inheritance graph
- - - - - + + + + + - - + +
[legend]
@@ -114,14 +127,14 @@
Collaboration graph
- - - - - + + + + + - - + +
[legend]
@@ -134,7 +147,7 @@ - + @@ -163,15 +176,14 @@ - + - + - - + @@ -188,7 +200,8 @@ + diff --git a/classnet_1_1mc_1_1tasks_1_1ArmIKTask__coll__graph.map b/classnet_1_1mc_1_1tasks_1_1ArmIKTask__coll__graph.map index 9c528d11..bae66408 100644 --- a/classnet_1_1mc_1_1tasks_1_1ArmIKTask__coll__graph.map +++ b/classnet_1_1mc_1_1tasks_1_1ArmIKTask__coll__graph.map @@ -1,10 +1,10 @@ - - - - - + + + + + - - + + diff --git a/classnet_1_1mc_1_1tasks_1_1ArmIKTask__coll__graph.md5 b/classnet_1_1mc_1_1tasks_1_1ArmIKTask__coll__graph.md5 index c76b2564..98d0e1df 100644 --- a/classnet_1_1mc_1_1tasks_1_1ArmIKTask__coll__graph.md5 +++ b/classnet_1_1mc_1_1tasks_1_1ArmIKTask__coll__graph.md5 @@ -1 +1 @@ -4d591e68682046ae6afa91996c5a0d85 \ No newline at end of file +c095a72c6aa01ba1fc86baa5b14bdf14 \ No newline at end of file diff --git a/classnet_1_1mc_1_1tasks_1_1ArmIKTask__coll__graph.png b/classnet_1_1mc_1_1tasks_1_1ArmIKTask__coll__graph.png index afe2d80b..6002372d 100644 Binary files a/classnet_1_1mc_1_1tasks_1_1ArmIKTask__coll__graph.png and b/classnet_1_1mc_1_1tasks_1_1ArmIKTask__coll__graph.png differ diff --git a/classnet_1_1mc_1_1tasks_1_1ArmIKTask__inherit__graph.map b/classnet_1_1mc_1_1tasks_1_1ArmIKTask__inherit__graph.map index 9c528d11..bae66408 100644 --- a/classnet_1_1mc_1_1tasks_1_1ArmIKTask__inherit__graph.map +++ b/classnet_1_1mc_1_1tasks_1_1ArmIKTask__inherit__graph.map @@ -1,10 +1,10 @@ - - - - - + + + + + - - + + diff --git a/classnet_1_1mc_1_1tasks_1_1ArmIKTask__inherit__graph.md5 b/classnet_1_1mc_1_1tasks_1_1ArmIKTask__inherit__graph.md5 index c76b2564..98d0e1df 100644 --- a/classnet_1_1mc_1_1tasks_1_1ArmIKTask__inherit__graph.md5 +++ b/classnet_1_1mc_1_1tasks_1_1ArmIKTask__inherit__graph.md5 @@ -1 +1 @@ -4d591e68682046ae6afa91996c5a0d85 \ No newline at end of file +c095a72c6aa01ba1fc86baa5b14bdf14 \ No newline at end of file diff --git a/classnet_1_1mc_1_1tasks_1_1ArmIKTask__inherit__graph.png b/classnet_1_1mc_1_1tasks_1_1ArmIKTask__inherit__graph.png index afe2d80b..6002372d 100644 Binary files a/classnet_1_1mc_1_1tasks_1_1ArmIKTask__inherit__graph.png and b/classnet_1_1mc_1_1tasks_1_1ArmIKTask__inherit__graph.png differ diff --git a/classnet_1_1mc_1_1tasks_1_1CameraStreamTask-members.html b/classnet_1_1mc_1_1tasks_1_1CameraStreamTask-members.html index a6af9e87..a2775c25 100644 --- a/classnet_1_1mc_1_1tasks_1_1CameraStreamTask-members.html +++ b/classnet_1_1mc_1_1tasks_1_1CameraStreamTask-members.html @@ -3,13 +3,15 @@ - +Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
 PeriodicTask (const std::chrono::milliseconds &period, const std::function< void()> &f)
 Construct a new periodic task.
 
- Public Member Functions inherited from util::AsyncTask< Clock >
- Public Member Functions inherited from util::AsyncTask< std::chrono::steady_clock >
 AsyncTask (const std::optional< std::string > &name=std::nullopt)
 Construct a new task.
 
void notify () override
 Not for use by client code.
 
- Protected Member Functions inherited from util::AsyncTask< Clock >
- Protected Member Functions inherited from util::AsyncTask< std::chrono::steady_clock >
bool isRunningInternal ()
 Version of AsyncTask::isRunning() that does no synchronization.
 
bool wait_until (std::unique_lock< std::mutex > &lock, const std::chrono::time_point< Clock > &tp)
bool wait_until (std::unique_lock< std::mutex > &lock, const std::chrono::time_point< std::chrono::steady_clock > &tp)
 Wait until the specified time point, or until the task has been stopped.
 
template<typename Rep , typename Period >
bool wait_for (std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)
bool wait_for (std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)
 Wait for a given duration, or until the task has been stopped.
 
void wait_until_done (std::unique_lock< std::mutex > &lock)
- + + +
+
net::mc::tasks::CameraStreamTask Member List
@@ -108,7 +121,8 @@
+
diff --git a/classnet_1_1mc_1_1tasks_1_1CameraStreamTask.html b/classnet_1_1mc_1_1tasks_1_1CameraStreamTask.html index 70046da9..4f2a79ae 100644 --- a/classnet_1_1mc_1_1tasks_1_1CameraStreamTask.html +++ b/classnet_1_1mc_1_1tasks_1_1CameraStreamTask.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): net::mc::tasks::CameraStreamTask Class Reference + + @@ -39,23 +41,33 @@
- + + + +
Public Member Functions | @@ -211,7 +224,7 @@

void net::mc::tasks::CameraStreamTask::openStream ( - const robot::types::CameraID & cam, + const robot::types::CameraID & cam, @@ -275,7 +288,8 @@

+

diff --git a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask-members.html b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask-members.html index b706a8e6..0ce0707d 100644 --- a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask-members.html +++ b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
net::mc::tasks::PowerRepeatTask Member List
@@ -89,12 +102,10 @@

This is the complete list of members for net::mc::tasks::PowerRepeatTask, including all inherited members.

- - - - - - + + + + @@ -102,14 +113,14 @@ - - - - + + +
AsyncTask(const std::optional< std::string > &name=std::nullopt)util::AsyncTask< Clock >inline
AsyncTask(const AsyncTask &)=delete (defined in util::AsyncTask< Clock >)util::AsyncTask< Clock >
isRunning()util::AsyncTask< Clock >inline
isRunningInternal()util::AsyncTask< Clock >inlineprotected
notify() overrideutil::PeriodicTask< Clock >inlineprotectedvirtual
operator=(const AsyncTask &)=delete (defined in util::AsyncTask< Clock >)util::AsyncTask< Clock >
AsyncTask(const std::optional< std::string > &name=std::nullopt)util::AsyncTask< std::chrono::steady_clock >inline
isRunning()util::AsyncTask< std::chrono::steady_clock >inline
isRunningInternal()util::AsyncTask< std::chrono::steady_clock >inlineprotected
notify() overrideutil::PeriodicTask< Clock >inlineprotectedvirtual
PeriodicTask(const std::chrono::milliseconds &period, const std::function< void()> &f)util::PeriodicTask< Clock >inline
PowerRepeatTask() (defined in net::mc::tasks::PowerRepeatTask)net::mc::tasks::PowerRepeatTask
setCmdVel(double steerVel, double xVel)net::mc::tasks::PowerRepeatTask
start() overridenet::mc::tasks::PowerRepeatTaskvirtual
stop() overridenet::mc::tasks::PowerRepeatTaskvirtual
task(std::unique_lock< std::mutex > &lock) overrideutil::PeriodicTask< Clock >inlineprotectedvirtual
wait_for(std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)util::AsyncTask< Clock >inlineprotected
wait_until(std::unique_lock< std::mutex > &lock, const std::chrono::time_point< Clock > &tp)util::AsyncTask< Clock >inlineprotected
wait_until_done(std::unique_lock< std::mutex > &lock)util::AsyncTask< Clock >inlineprotected
~AsyncTask() (defined in util::AsyncTask< Clock >)util::AsyncTask< Clock >inlinevirtual
wait_for(std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)util::AsyncTask< std::chrono::steady_clock >inlineprotected
wait_until(std::unique_lock< std::mutex > &lock, const std::chrono::time_point< std::chrono::steady_clock > &tp)util::AsyncTask< std::chrono::steady_clock >inlineprotected
wait_until_done(std::unique_lock< std::mutex > &lock)util::AsyncTask< std::chrono::steady_clock >inlineprotected
+ diff --git a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html index 35448825..7d1ac546 100644 --- a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html +++ b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): net::mc::tasks::PowerRepeatTask Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -99,14 +112,14 @@
Inheritance graph
- - - - - + + + + + - - + +
[legend]
@@ -114,14 +127,14 @@
Collaboration graph
- - - - - + + + + + - - + +
[legend]
@@ -143,7 +156,7 @@ - + @@ -166,15 +179,14 @@ - + - + - - + @@ -194,7 +206,7 @@

void net::mc::tasks::PowerRepeatTask::setCmdVel

- + @@ -218,7 +230,7 @@

void net::mc::tasks::PowerRepeatTask::setJointPower

- + @@ -245,7 +257,7 @@

void net::mc::tasks::PowerRepeatTask::start

- +
 PeriodicTask (const std::chrono::milliseconds &period, const std::function< void()> &f)
 Construct a new periodic task.
 
- Public Member Functions inherited from util::AsyncTask< Clock >
- Public Member Functions inherited from util::AsyncTask< std::chrono::steady_clock >
 AsyncTask (const std::optional< std::string > &name=std::nullopt)
 Construct a new task.
 
void notify () override
 Not for use by client code.
 
- Protected Member Functions inherited from util::AsyncTask< Clock >
- Protected Member Functions inherited from util::AsyncTask< std::chrono::steady_clock >
bool isRunningInternal ()
 Version of AsyncTask::isRunning() that does no synchronization.
 
bool wait_until (std::unique_lock< std::mutex > &lock, const std::chrono::time_point< Clock > &tp)
bool wait_until (std::unique_lock< std::mutex > &lock, const std::chrono::time_point< std::chrono::steady_clock > &tp)
 Wait until the specified time point, or until the task has been stopped.
 
template<typename Rep , typename Period >
bool wait_for (std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)
bool wait_for (std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)
 Wait for a given duration, or until the task has been stopped.
 
void wait_until_done (std::unique_lock< std::mutex > &lock)
(double steerVel, double steerVel,
(robot::types::jointid_t id, robot::types::jointid_t id,
())
@@ -259,7 +271,7 @@

util::AsyncTask< Clock >.

+

Reimplemented from util::AsyncTask< std::chrono::steady_clock >.

@@ -275,7 +287,7 @@

void net::mc::tasks::PowerRepeatTask::stop ( - ) + ) @@ -289,7 +301,7 @@

util::AsyncTask< Clock >.

+

Reimplemented from util::AsyncTask< std::chrono::steady_clock >.

@@ -300,7 +312,8 @@

+ diff --git a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__coll__graph.map b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__coll__graph.map index 6cdaf133..449d4d12 100644 --- a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__coll__graph.map +++ b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__coll__graph.map @@ -1,10 +1,10 @@ - - - - - + + + + + - - + + diff --git a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__coll__graph.md5 b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__coll__graph.md5 index 2b8e2710..d6354a3b 100644 --- a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__coll__graph.md5 +++ b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__coll__graph.md5 @@ -1 +1 @@ -349ab0dc96d1342a7ca2e5f580a72710 \ No newline at end of file +da63d3e0bf9e54fcc3153eca5defde47 \ No newline at end of file diff --git a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__coll__graph.png b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__coll__graph.png index d21fc424..ef9f5abc 100644 Binary files a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__coll__graph.png and b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__coll__graph.png differ diff --git a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__inherit__graph.map b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__inherit__graph.map index 6cdaf133..449d4d12 100644 --- a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__inherit__graph.map +++ b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__inherit__graph.map @@ -1,10 +1,10 @@ - - - - - + + + + + - - + + diff --git a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__inherit__graph.md5 b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__inherit__graph.md5 index 2b8e2710..d6354a3b 100644 --- a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__inherit__graph.md5 +++ b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__inherit__graph.md5 @@ -1 +1 @@ -349ab0dc96d1342a7ca2e5f580a72710 \ No newline at end of file +da63d3e0bf9e54fcc3153eca5defde47 \ No newline at end of file diff --git a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__inherit__graph.png b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__inherit__graph.png index d21fc424..ef9f5abc 100644 Binary files a/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__inherit__graph.png and b/classnet_1_1mc_1_1tasks_1_1PowerRepeatTask__inherit__graph.png differ diff --git a/classnet_1_1mc_1_1tasks_1_1TelemReportTask-members.html b/classnet_1_1mc_1_1tasks_1_1TelemReportTask-members.html index 6788ffc0..bdab1d72 100644 --- a/classnet_1_1mc_1_1tasks_1_1TelemReportTask-members.html +++ b/classnet_1_1mc_1_1tasks_1_1TelemReportTask-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@ - + + + +
net::mc::tasks::TelemReportTask Member List
@@ -89,25 +102,23 @@

This is the complete list of members for net::mc::tasks::TelemReportTask, including all inherited members.

- - - - - - + + + + - - + + - - - - + + +
AsyncTask(const std::optional< std::string > &name=std::nullopt)util::AsyncTask< Clock >inline
AsyncTask(const AsyncTask &)=delete (defined in util::AsyncTask< Clock >)util::AsyncTask< Clock >
isRunning()util::AsyncTask< Clock >inline
isRunningInternal()util::AsyncTask< Clock >inlineprotected
notify() overrideutil::PeriodicTask< Clock >inlineprotectedvirtual
operator=(const AsyncTask &)=delete (defined in util::AsyncTask< Clock >)util::AsyncTask< Clock >
AsyncTask(const std::optional< std::string > &name=std::nullopt)util::AsyncTask< std::chrono::steady_clock >inline
isRunning()util::AsyncTask< std::chrono::steady_clock >inline
isRunningInternal()util::AsyncTask< std::chrono::steady_clock >inlineprotected
notify() overrideutil::PeriodicTask< Clock >inlineprotectedvirtual
PeriodicTask(const std::chrono::milliseconds &period, const std::function< void()> &f)util::PeriodicTask< Clock >inline
start()util::AsyncTask< Clock >inlinevirtual
stop()util::AsyncTask< Clock >inlinevirtual
start()util::AsyncTask< std::chrono::steady_clock >inlinevirtual
stop()util::AsyncTask< std::chrono::steady_clock >inlinevirtual
task(std::unique_lock< std::mutex > &lock) overrideutil::PeriodicTask< Clock >inlineprotectedvirtual
TelemReportTask(websocket::SingleClientWSServer &server) (defined in net::mc::tasks::TelemReportTask)net::mc::tasks::TelemReportTask
wait_for(std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)util::AsyncTask< Clock >inlineprotected
wait_until(std::unique_lock< std::mutex > &lock, const std::chrono::time_point< Clock > &tp)util::AsyncTask< Clock >inlineprotected
wait_until_done(std::unique_lock< std::mutex > &lock)util::AsyncTask< Clock >inlineprotected
~AsyncTask() (defined in util::AsyncTask< Clock >)util::AsyncTask< Clock >inlinevirtual
wait_for(std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)util::AsyncTask< std::chrono::steady_clock >inlineprotected
wait_until(std::unique_lock< std::mutex > &lock, const std::chrono::time_point< std::chrono::steady_clock > &tp)util::AsyncTask< std::chrono::steady_clock >inlineprotected
wait_until_done(std::unique_lock< std::mutex > &lock)util::AsyncTask< std::chrono::steady_clock >inlineprotected
+ diff --git a/classnet_1_1mc_1_1tasks_1_1TelemReportTask.html b/classnet_1_1mc_1_1tasks_1_1TelemReportTask.html index 574c979a..55e44e89 100644 --- a/classnet_1_1mc_1_1tasks_1_1TelemReportTask.html +++ b/classnet_1_1mc_1_1tasks_1_1TelemReportTask.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): net::mc::tasks::TelemReportTask Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -99,14 +112,14 @@
Inheritance graph
- - - - - + + + + + - - + +
[legend]
@@ -114,14 +127,14 @@
Collaboration graph
- - - - - + + + + + - - + +
[legend]
@@ -134,7 +147,7 @@ - + @@ -163,15 +176,14 @@ - + - + - - + @@ -187,7 +199,8 @@ + diff --git a/classnet_1_1mc_1_1tasks_1_1TelemReportTask__coll__graph.map b/classnet_1_1mc_1_1tasks_1_1TelemReportTask__coll__graph.map index 33edbe86..0249c2d5 100644 --- a/classnet_1_1mc_1_1tasks_1_1TelemReportTask__coll__graph.map +++ b/classnet_1_1mc_1_1tasks_1_1TelemReportTask__coll__graph.map @@ -1,10 +1,10 @@ - - - - - + + + + + - - + + diff --git a/classnet_1_1mc_1_1tasks_1_1TelemReportTask__coll__graph.md5 b/classnet_1_1mc_1_1tasks_1_1TelemReportTask__coll__graph.md5 index 5f78c662..c1dfe322 100644 --- a/classnet_1_1mc_1_1tasks_1_1TelemReportTask__coll__graph.md5 +++ b/classnet_1_1mc_1_1tasks_1_1TelemReportTask__coll__graph.md5 @@ -1 +1 @@ -fdd29fd8ceadc5f03cc391c002682fb8 \ No newline at end of file +1e1b763c4a7abcc84f55936f4433550e \ No newline at end of file diff --git a/classnet_1_1mc_1_1tasks_1_1TelemReportTask__coll__graph.png b/classnet_1_1mc_1_1tasks_1_1TelemReportTask__coll__graph.png index 638e9846..4d26be6a 100644 Binary files a/classnet_1_1mc_1_1tasks_1_1TelemReportTask__coll__graph.png and b/classnet_1_1mc_1_1tasks_1_1TelemReportTask__coll__graph.png differ diff --git a/classnet_1_1mc_1_1tasks_1_1TelemReportTask__inherit__graph.map b/classnet_1_1mc_1_1tasks_1_1TelemReportTask__inherit__graph.map index 33edbe86..0249c2d5 100644 --- a/classnet_1_1mc_1_1tasks_1_1TelemReportTask__inherit__graph.map +++ b/classnet_1_1mc_1_1tasks_1_1TelemReportTask__inherit__graph.map @@ -1,10 +1,10 @@ - - - - - + + + + + - - + + diff --git a/classnet_1_1mc_1_1tasks_1_1TelemReportTask__inherit__graph.md5 b/classnet_1_1mc_1_1tasks_1_1TelemReportTask__inherit__graph.md5 index 5f78c662..c1dfe322 100644 --- a/classnet_1_1mc_1_1tasks_1_1TelemReportTask__inherit__graph.md5 +++ b/classnet_1_1mc_1_1tasks_1_1TelemReportTask__inherit__graph.md5 @@ -1 +1 @@ -fdd29fd8ceadc5f03cc391c002682fb8 \ No newline at end of file +1e1b763c4a7abcc84f55936f4433550e \ No newline at end of file diff --git a/classnet_1_1mc_1_1tasks_1_1TelemReportTask__inherit__graph.png b/classnet_1_1mc_1_1tasks_1_1TelemReportTask__inherit__graph.png index 638e9846..4d26be6a 100644 Binary files a/classnet_1_1mc_1_1tasks_1_1TelemReportTask__inherit__graph.png and b/classnet_1_1mc_1_1tasks_1_1TelemReportTask__inherit__graph.png differ diff --git a/classnet_1_1websocket_1_1SingleClientWSServer-members.html b/classnet_1_1websocket_1_1SingleClientWSServer-members.html index aacac529..3f0c0a61 100644 --- a/classnet_1_1websocket_1_1SingleClientWSServer-members.html +++ b/classnet_1_1websocket_1_1SingleClientWSServer-members.html @@ -3,13 +3,15 @@ - +Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
 PeriodicTask (const std::chrono::milliseconds &period, const std::function< void()> &f)
 Construct a new periodic task.
 
- Public Member Functions inherited from util::AsyncTask< Clock >
- Public Member Functions inherited from util::AsyncTask< std::chrono::steady_clock >
 AsyncTask (const std::optional< std::string > &name=std::nullopt)
 Construct a new task.
 
void notify () override
 Not for use by client code.
 
- Protected Member Functions inherited from util::AsyncTask< Clock >
- Protected Member Functions inherited from util::AsyncTask< std::chrono::steady_clock >
bool isRunningInternal ()
 Version of AsyncTask::isRunning() that does no synchronization.
 
bool wait_until (std::unique_lock< std::mutex > &lock, const std::chrono::time_point< Clock > &tp)
bool wait_until (std::unique_lock< std::mutex > &lock, const std::chrono::time_point< std::chrono::steady_clock > &tp)
 Wait until the specified time point, or until the task has been stopped.
 
template<typename Rep , typename Period >
bool wait_for (std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)
bool wait_for (std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)
 Wait for a given duration, or until the task has been stopped.
 
void wait_until_done (std::unique_lock< std::mutex > &lock)
- + + +
+
net::websocket::SingleClientWSServer Member List
@@ -100,7 +113,8 @@
+
diff --git a/classnet_1_1websocket_1_1SingleClientWSServer.html b/classnet_1_1websocket_1_1SingleClientWSServer.html index 6fdf77fc..f8f56fc7 100644 --- a/classnet_1_1websocket_1_1SingleClientWSServer.html +++ b/classnet_1_1websocket_1_1SingleClientWSServer.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): net::websocket::SingleClientWSServer Class Reference + + @@ -39,23 +41,33 @@
- + + + +
diff --git a/classnet_1_1websocket_1_1WebSocketProtocol-members.html b/classnet_1_1websocket_1_1WebSocketProtocol-members.html index 0556ccef..6f68344e 100644 --- a/classnet_1_1websocket_1_1WebSocketProtocol-members.html +++ b/classnet_1_1websocket_1_1WebSocketProtocol-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
net::websocket::WebSocketProtocol Member List
@@ -103,7 +116,8 @@
+ diff --git a/classnet_1_1websocket_1_1WebSocketProtocol.html b/classnet_1_1websocket_1_1WebSocketProtocol.html index 981969fb..7374c386 100644 --- a/classnet_1_1websocket_1_1WebSocketProtocol.html +++ b/classnet_1_1websocket_1_1WebSocketProtocol.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): net::websocket::WebSocketProtocol Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -183,7 +196,7 @@

bool net::websocket::WebSocketProtocol::addMessageHandler ( - const std::string & messageType, + const std::string & messageType, @@ -215,12 +228,12 @@

bool net::websocket::WebSocketProtocol::addMessageHandler ( - const std::string & messageType, + const std::string & messageType, - const msghandler_t & callback, + const msghandler_t & callback, @@ -253,7 +266,7 @@

std::string net::websocket::WebSocketProtocol::getProtocolPath ( - ) + ) const @@ -325,7 +338,7 @@

void net::websocket::WebSocketProtocol::setHeartbeatTimedOutHandler ( - std::chrono::milliseconds timeout, + std::chrono::milliseconds timeout, @@ -354,7 +367,8 @@

+

diff --git a/classrobot_1_1base__motor-members.html b/classrobot_1_1base__motor-members.html index afc79f4a..3ca26ec1 100644 --- a/classrobot_1_1base__motor-members.html +++ b/classrobot_1_1base__motor-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
robot::base_motor Member List
@@ -108,7 +121,8 @@
+ diff --git a/classrobot_1_1base__motor.html b/classrobot_1_1base__motor.html index b7e45c80..f2006ed3 100644 --- a/classrobot_1_1base__motor.html +++ b/classrobot_1_1base__motor.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): robot::base_motor Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -196,7 +209,7 @@

robot::base_motor::base_motor ( - robot::types::motorid_t motor, + robot::types::motorid_t motor, @@ -229,7 +242,7 @@

robot::base_motor::base_motor ( - const base_motor & ) + const base_motor & ) @@ -263,7 +276,7 @@

virtual types::DataPoint< int32_t > robot::base_motor::getMotorPos ( - ) + ) const @@ -290,7 +303,7 @@

bool robot::base_motor::hasPositionSensor ( - ) + ) const @@ -313,7 +326,7 @@

base_motor & robot::base_motor::operator= ( - const base_motor & ) + const base_motor & ) @@ -447,7 +460,8 @@

+

diff --git a/classrobot_1_1can__motor-members.html b/classrobot_1_1can__motor-members.html index f47764e6..661c5f77 100644 --- a/classrobot_1_1can__motor-members.html +++ b/classrobot_1_1can__motor-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
robot::can_motor Member List
@@ -110,7 +123,8 @@
+ diff --git a/classrobot_1_1can__motor.html b/classrobot_1_1can__motor.html index a002c717..023ec746 100644 --- a/classrobot_1_1can__motor.html +++ b/classrobot_1_1can__motor.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): robot::can_motor Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -191,22 +204,22 @@

robot::can_motor::can_motor ( - robot::types::motorid_t motor, + robot::types::motorid_t motor, - bool hasPosSensor, + bool hasPosSensor, - can::deviceserial_t serial, + can::deviceserial_t serial, - double pos_pwm_scale, + double pos_pwm_scale, @@ -243,7 +256,7 @@

types::DataPoint< int32_t > robot::can_motor::getMotorPos ( - ) + ) const @@ -374,7 +387,8 @@

+

diff --git a/classrobot_1_1sim__motor-members.html b/classrobot_1_1sim__motor-members.html index c5fb9eee..2486fbbe 100644 --- a/classrobot_1_1sim__motor-members.html +++ b/classrobot_1_1sim__motor-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
robot::sim_motor Member List
@@ -109,7 +122,8 @@
+ diff --git a/classrobot_1_1sim__motor.html b/classrobot_1_1sim__motor.html index bbb70ada..e1c81ce9 100644 --- a/classrobot_1_1sim__motor.html +++ b/classrobot_1_1sim__motor.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): robot::sim_motor Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -187,17 +200,17 @@

robot::sim_motor::sim_motor ( - robot::types::motorid_t motor, + robot::types::motorid_t motor, - bool hasPosSensor, + bool hasPosSensor, - const std::string & name, + const std::string & name, @@ -233,7 +246,7 @@

types::DataPoint< int32_t > robot::sim_motor::getMotorPos ( - ) + ) const @@ -329,7 +342,8 @@

+

diff --git a/classrobot_1_1types_1_1DataPoint-members.html b/classrobot_1_1types_1_1DataPoint-members.html index c57b269e..32868491 100644 --- a/classrobot_1_1types_1_1DataPoint-members.html +++ b/classrobot_1_1types_1_1DataPoint-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
robot::types::DataPoint< T > Member List
@@ -98,12 +111,12 @@ isFresh(std::chrono::milliseconds duration) constrobot::types::DataPoint< T >inline isValid() constrobot::types::DataPoint< T >inline operator bool() constrobot::types::DataPoint< T >inline - operator T() constrobot::types::DataPoint< T >inline - transform(const F &f)robot::types::DataPoint< T >inline + transform(const F &f)robot::types::DataPoint< T >inline
+ diff --git a/classrobot_1_1types_1_1DataPoint.html b/classrobot_1_1types_1_1DataPoint.html index 724d0fa7..7da2b525 100644 --- a/classrobot_1_1types_1_1DataPoint.html +++ b/classrobot_1_1types_1_1DataPoint.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): robot::types::DataPoint< T > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -107,9 +120,6 @@  DataPoint (datatime_t time, T data)  Construct a new DataPoint object, measured at the given time.
  - operator T () const - Implicitly convert to the required data type.
-   operator bool () const  Check if this measurement is valid.
  @@ -192,7 +202,7 @@

robot::types::DataPoint< T >::DataPoint ( - datatime_t time, + datatime_t time, @@ -233,7 +243,7 @@

T robot::types::DataPoint< T >::getData ( - ) + ) const @@ -245,8 +255,13 @@

Get the value of this data point.

-

UB if data point is not valid.

Returns
T The value of this data point.
+
Exceptions
+ + +
bad_datapoint_accessIf this data point is not valid.
+
+

@@ -300,7 +315,7 @@

datatime_t robot::types::DataPoint< T >::getTime ( - ) + ) const @@ -367,7 +382,7 @@

bool robot::types::DataPoint< T >::isValid ( - ) + ) const @@ -397,7 +412,7 @@

robot::types::DataPoint< T >::operator bool ( - ) + ) const @@ -412,37 +427,6 @@

isValid().

Returns
bool True iff this datapoint has a value.
-

- - -

◆ operator T()

- -
-
-
-template<typename T >
- - - - - -
- - - - - - - -
robot::types::DataPoint< T >::operator T () const
-
-inline
-
- -

Implicitly convert to the required data type.

-

UB if datapoint is invalid. Equivalent to getData().

-
Returns
T The value of this datapoint.
-
@@ -495,7 +479,8 @@

+ diff --git a/classrobot_1_1types_1_1LimitSwitchData-members.html b/classrobot_1_1types_1_1LimitSwitchData-members.html index 832ab741..05baed27 100644 --- a/classrobot_1_1types_1_1LimitSwitchData-members.html +++ b/classrobot_1_1types_1_1LimitSwitchData-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@ - + + + +
robot::types::LimitSwitchData Member List
@@ -98,7 +111,8 @@
+ diff --git a/classrobot_1_1types_1_1LimitSwitchData.html b/classrobot_1_1types_1_1LimitSwitchData.html index bfbbc629..1753a8fd 100644 --- a/classrobot_1_1types_1_1LimitSwitchData.html +++ b/classrobot_1_1types_1_1LimitSwitchData.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): robot::types::LimitSwitchData Class Reference + + @@ -39,23 +41,33 @@ - + + + + diff --git a/classrobot_1_1types_1_1bad__datapoint__access-members.html b/classrobot_1_1types_1_1bad__datapoint__access-members.html new file mode 100644 index 00000000..f8513528 --- /dev/null +++ b/classrobot_1_1types_1_1bad__datapoint__access-members.html @@ -0,0 +1,115 @@ + + + + + + + +Resurgence (PY2022): Member List + + + + + + + + + + + + + + + +
+
+ + + + + + +
+
Resurgence (PY2022) +
+
Codebase for the Husky Robotics 2021-2022 rover Resurgence
+
+
+ + + + + + + + + + +
+
+ + +
+
+
+
+
+
Loading...
+
Searching...
+
No Matches
+
+
+
+
+ + +
+
+
+
robot::types::bad_datapoint_access Member List
+
+
+ +

This is the complete list of members for robot::types::bad_datapoint_access, including all inherited members.

+ + + + +
bad_datapoint_access() (defined in robot::types::bad_datapoint_access)robot::types::bad_datapoint_accessinline
runtime_error(const string &__arg) _GLIBCXX_TXN_SAFEstd::runtime_error
what() const _GLIBCXX_TXN_SAFE_DYN noexceptstd::runtime_errorvirtual
+ + +
+ + diff --git a/classrobot_1_1types_1_1bad__datapoint__access.html b/classrobot_1_1types_1_1bad__datapoint__access.html new file mode 100644 index 00000000..a81fef4e --- /dev/null +++ b/classrobot_1_1types_1_1bad__datapoint__access.html @@ -0,0 +1,148 @@ + + + + + + + +Resurgence (PY2022): robot::types::bad_datapoint_access Class Reference + + + + + + + + + + + + + + + +
+
+ + + + + + +
+
Resurgence (PY2022) +
+
Codebase for the Husky Robotics 2021-2022 rover Resurgence
+
+
+ + + + + + + + + + +
+
+ + +
+
+
+
+
+
Loading...
+
Searching...
+
No Matches
+
+
+
+
+ + +
+
+
+ +
robot::types::bad_datapoint_access Class Reference
+
+
+
+Inheritance diagram for robot::types::bad_datapoint_access:
+
+
Inheritance graph
+ + + + + + + +
[legend]
+
+Collaboration diagram for robot::types::bad_datapoint_access:
+
+
Collaboration graph
+ + + + + + + +
[legend]
+ + + + + + + +

+Additional Inherited Members

- Public Member Functions inherited from std::runtime_error
runtime_error (const string &__arg) _GLIBCXX_TXN_SAFE
 
virtual const char * what () const _GLIBCXX_TXN_SAFE_DYN noexcept
 
+
The documentation for this class was generated from the following file:
    +
  • src/world_interface/data.h
  • +
+
+ + +
+ + diff --git a/classrobot_1_1types_1_1bad__datapoint__access__coll__graph.map b/classrobot_1_1types_1_1bad__datapoint__access__coll__graph.map new file mode 100644 index 00000000..109eb381 --- /dev/null +++ b/classrobot_1_1types_1_1bad__datapoint__access__coll__graph.map @@ -0,0 +1,7 @@ + + + + + + + diff --git a/classrobot_1_1types_1_1bad__datapoint__access__coll__graph.md5 b/classrobot_1_1types_1_1bad__datapoint__access__coll__graph.md5 new file mode 100644 index 00000000..b624e27b --- /dev/null +++ b/classrobot_1_1types_1_1bad__datapoint__access__coll__graph.md5 @@ -0,0 +1 @@ +0337185b61484460215f0f1964e06af5 \ No newline at end of file diff --git a/classrobot_1_1types_1_1bad__datapoint__access__coll__graph.png b/classrobot_1_1types_1_1bad__datapoint__access__coll__graph.png new file mode 100644 index 00000000..43f71c51 Binary files /dev/null and b/classrobot_1_1types_1_1bad__datapoint__access__coll__graph.png differ diff --git a/classrobot_1_1types_1_1bad__datapoint__access__inherit__graph.map b/classrobot_1_1types_1_1bad__datapoint__access__inherit__graph.map new file mode 100644 index 00000000..109eb381 --- /dev/null +++ b/classrobot_1_1types_1_1bad__datapoint__access__inherit__graph.map @@ -0,0 +1,7 @@ + + + + + + + diff --git a/classrobot_1_1types_1_1bad__datapoint__access__inherit__graph.md5 b/classrobot_1_1types_1_1bad__datapoint__access__inherit__graph.md5 new file mode 100644 index 00000000..b624e27b --- /dev/null +++ b/classrobot_1_1types_1_1bad__datapoint__access__inherit__graph.md5 @@ -0,0 +1 @@ +0337185b61484460215f0f1964e06af5 \ No newline at end of file diff --git a/classrobot_1_1types_1_1bad__datapoint__access__inherit__graph.png b/classrobot_1_1types_1_1bad__datapoint__access__inherit__graph.png new file mode 100644 index 00000000..43f71c51 Binary files /dev/null and b/classrobot_1_1types_1_1bad__datapoint__access__inherit__graph.png differ diff --git a/classutil_1_1AsyncTask-members.html b/classutil_1_1AsyncTask-members.html index 7c4b4673..818b4d68 100644 --- a/classutil_1_1AsyncTask-members.html +++ b/classutil_1_1AsyncTask-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@ - + + + +
util::AsyncTask< Clock > Member List
@@ -106,7 +119,8 @@
+ diff --git a/classutil_1_1AsyncTask.html b/classutil_1_1AsyncTask.html index 965d690e..16c7de22 100644 --- a/classutil_1_1AsyncTask.html +++ b/classutil_1_1AsyncTask.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): util::AsyncTask< Clock > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -101,19 +114,11 @@
Inheritance graph
- - - - - - - - - - - - - + + + + +
[legend]
@@ -202,7 +207,7 @@

util::AsyncTask< Clock >::AsyncTask ( - const std::optional< std::string > & name = std::nullopt) + const std::optional< std::string > & name = std::nullopt) @@ -238,7 +243,7 @@

bool util::AsyncTask< Clock >::isRunning ( - ) + ) @@ -268,7 +273,7 @@

bool util::AsyncTask< Clock >::isRunningInternal ( - ) + ) @@ -299,7 +304,7 @@

void util::AsyncTask< Clock >::notify ( - ) + ) @@ -332,7 +337,7 @@

virtual void util::AsyncTask< Clock >::start ( - ) + ) @@ -364,7 +369,7 @@

virtual void util::AsyncTask< Clock >::stop ( - ) + ) @@ -436,7 +441,7 @@

bool util::AsyncTask< Clock >::wait_for ( - std::unique_lock< std::mutex > & lock, + std::unique_lock< std::mutex > & lock, @@ -477,7 +482,7 @@

bool util::AsyncTask< Clock >::wait_until ( - std::unique_lock< std::mutex > & lock, + std::unique_lock< std::mutex > & lock, @@ -545,7 +550,8 @@

+

diff --git a/classutil_1_1AsyncTask__inherit__graph.map b/classutil_1_1AsyncTask__inherit__graph.map index a81baca4..77e2ce1d 100644 --- a/classutil_1_1AsyncTask__inherit__graph.map +++ b/classutil_1_1AsyncTask__inherit__graph.map @@ -1,15 +1,7 @@ - - - - - - - - - - - - - + + + + + diff --git a/classutil_1_1AsyncTask__inherit__graph.md5 b/classutil_1_1AsyncTask__inherit__graph.md5 index 411af153..2ee3587c 100644 --- a/classutil_1_1AsyncTask__inherit__graph.md5 +++ b/classutil_1_1AsyncTask__inherit__graph.md5 @@ -1 +1 @@ -9827179d90186305f06d3ffe5a2405f0 \ No newline at end of file +07fe35bc282113e00a653f9e1acf0d41 \ No newline at end of file diff --git a/classutil_1_1AsyncTask__inherit__graph.png b/classutil_1_1AsyncTask__inherit__graph.png index 24bfc9ec..f4decf7c 100644 Binary files a/classutil_1_1AsyncTask__inherit__graph.png and b/classutil_1_1AsyncTask__inherit__graph.png differ diff --git a/classutil_1_1PeriodicScheduler-members.html b/classutil_1_1PeriodicScheduler-members.html index d96c2f24..7e514d7d 100644 --- a/classutil_1_1PeriodicScheduler-members.html +++ b/classutil_1_1PeriodicScheduler-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
util::PeriodicScheduler< Clock > Member List
@@ -101,7 +114,8 @@
+
diff --git a/classutil_1_1PeriodicScheduler.html b/classutil_1_1PeriodicScheduler.html index ea04074f..181d711a 100644 --- a/classutil_1_1PeriodicScheduler.html +++ b/classutil_1_1PeriodicScheduler.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): util::PeriodicScheduler< Clock > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Types | @@ -180,7 +193,7 @@

util::PeriodicScheduler< Clock >::PeriodicScheduler ( - const std::optional< std::string > & name = std::nullopt) + const std::optional< std::string > & name = std::nullopt) @@ -216,7 +229,7 @@

void util::PeriodicScheduler< Clock >::clear ( - ) + ) @@ -282,7 +295,7 @@

eventid_t util::PeriodicScheduler< Clock >::scheduleEvent ( - std::chrono::milliseconds period, + std::chrono::milliseconds period, @@ -316,7 +329,8 @@

+

diff --git a/classutil_1_1PeriodicTask-members.html b/classutil_1_1PeriodicTask-members.html index 98955e52..b03296cf 100644 --- a/classutil_1_1PeriodicTask-members.html +++ b/classutil_1_1PeriodicTask-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
util::PeriodicTask< Clock > Member List
@@ -89,25 +102,23 @@

This is the complete list of members for util::PeriodicTask< Clock >, including all inherited members.

- - - - - - + + + + - - + + - - - - + + +
AsyncTask(const std::optional< std::string > &name=std::nullopt)util::AsyncTask< Clock >inline
AsyncTask(const AsyncTask &)=delete (defined in util::AsyncTask< Clock >)util::AsyncTask< Clock >
isRunning()util::AsyncTask< Clock >inline
isRunningInternal()util::AsyncTask< Clock >inlineprotected
notify() overrideutil::PeriodicTask< Clock >inlineprotectedvirtual
operator=(const AsyncTask &)=delete (defined in util::AsyncTask< Clock >)util::AsyncTask< Clock >
AsyncTask(const std::optional< std::string > &name=std::nullopt)util::AsyncTask< std::chrono::steady_clock >inline
isRunning()util::AsyncTask< std::chrono::steady_clock >inline
isRunningInternal()util::AsyncTask< std::chrono::steady_clock >inlineprotected
notify() overrideutil::PeriodicTask< Clock >inlineprotectedvirtual
PeriodicTask(const std::chrono::milliseconds &period, const std::function< void()> &f)util::PeriodicTask< Clock >inline
start()util::AsyncTask< Clock >inlinevirtual
stop()util::AsyncTask< Clock >inlinevirtual
start()util::AsyncTask< std::chrono::steady_clock >inlinevirtual
stop()util::AsyncTask< std::chrono::steady_clock >inlinevirtual
task(std::unique_lock< std::mutex > &lock) overrideutil::PeriodicTask< Clock >inlineprotectedvirtual
util::impl::notifyScheduler (defined in util::PeriodicTask< Clock >)util::PeriodicTask< Clock >friend
wait_for(std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)util::AsyncTask< Clock >inlineprotected
wait_until(std::unique_lock< std::mutex > &lock, const std::chrono::time_point< Clock > &tp)util::AsyncTask< Clock >inlineprotected
wait_until_done(std::unique_lock< std::mutex > &lock)util::AsyncTask< Clock >inlineprotected
~AsyncTask() (defined in util::AsyncTask< Clock >)util::AsyncTask< Clock >inlinevirtual
wait_for(std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)util::AsyncTask< std::chrono::steady_clock >inlineprotected
wait_until(std::unique_lock< std::mutex > &lock, const std::chrono::time_point< std::chrono::steady_clock > &tp)util::AsyncTask< std::chrono::steady_clock >inlineprotected
wait_until_done(std::unique_lock< std::mutex > &lock)util::AsyncTask< std::chrono::steady_clock >inlineprotected
+ diff --git a/classutil_1_1PeriodicTask.html b/classutil_1_1PeriodicTask.html index 0c213cc5..bde26fce 100644 --- a/classutil_1_1PeriodicTask.html +++ b/classutil_1_1PeriodicTask.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): util::PeriodicTask< Clock > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -101,18 +114,18 @@
Inheritance graph
- - - - - - - - - + + + + + + + + + - - + +
[legend]
@@ -120,12 +133,12 @@
Collaboration graph
- - - + + + - - + +
[legend]
@@ -134,7 +147,7 @@ - + @@ -162,15 +175,14 @@ - + - + - - + @@ -208,7 +220,7 @@

util::PeriodicTask< Clock >::PeriodicTask

- + @@ -249,7 +261,7 @@

void util::PeriodicTask< Clock >::notify

- +
 PeriodicTask (const std::chrono::milliseconds &period, const std::function< void()> &f)
 Construct a new periodic task.
 
- Public Member Functions inherited from util::AsyncTask< Clock >
- Public Member Functions inherited from util::AsyncTask< std::chrono::steady_clock >
 AsyncTask (const std::optional< std::string > &name=std::nullopt)
 Construct a new task.
 
void notify () override
 Not for use by client code.
 
- Protected Member Functions inherited from util::AsyncTask< Clock >
- Protected Member Functions inherited from util::AsyncTask< std::chrono::steady_clock >
bool isRunningInternal ()
 Version of AsyncTask::isRunning() that does no synchronization.
 
bool wait_until (std::unique_lock< std::mutex > &lock, const std::chrono::time_point< Clock > &tp)
bool wait_until (std::unique_lock< std::mutex > &lock, const std::chrono::time_point< std::chrono::steady_clock > &tp)
 Wait until the specified time point, or until the task has been stopped.
 
template<typename Rep , typename Period >
bool wait_for (std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)
bool wait_for (std::unique_lock< std::mutex > &lock, const std::chrono::duration< Rep, Period > &dur)
 Wait for a given duration, or until the task has been stopped.
 
void wait_until_done (std::unique_lock< std::mutex > &lock)
(const std::chrono::milliseconds & period, const std::chrono::milliseconds & period,
())
@@ -262,7 +274,7 @@

util::AsyncTask< Clock >.

+

Reimplemented from util::AsyncTask< std::chrono::steady_clock >.

@@ -300,7 +312,7 @@

util::AsyncTask< Clock >.

+

Implements util::AsyncTask< std::chrono::steady_clock >.

@@ -310,7 +322,8 @@

+ diff --git a/classutil_1_1PeriodicTask__coll__graph.map b/classutil_1_1PeriodicTask__coll__graph.map index a294b9e9..8b18ec93 100644 --- a/classutil_1_1PeriodicTask__coll__graph.map +++ b/classutil_1_1PeriodicTask__coll__graph.map @@ -1,8 +1,8 @@ - - - + + + - - + + diff --git a/classutil_1_1PeriodicTask__coll__graph.md5 b/classutil_1_1PeriodicTask__coll__graph.md5 index a92ac2e0..aef16d39 100644 --- a/classutil_1_1PeriodicTask__coll__graph.md5 +++ b/classutil_1_1PeriodicTask__coll__graph.md5 @@ -1 +1 @@ -a04fdee9db1edc291c3a8977b93b4ca2 \ No newline at end of file +ec7a52716c1f218ea7c42b5320cff181 \ No newline at end of file diff --git a/classutil_1_1PeriodicTask__coll__graph.png b/classutil_1_1PeriodicTask__coll__graph.png index 67885067..fcbfc028 100644 Binary files a/classutil_1_1PeriodicTask__coll__graph.png and b/classutil_1_1PeriodicTask__coll__graph.png differ diff --git a/classutil_1_1PeriodicTask__inherit__graph.map b/classutil_1_1PeriodicTask__inherit__graph.map index 8024f8c5..1fbb1f47 100644 --- a/classutil_1_1PeriodicTask__inherit__graph.map +++ b/classutil_1_1PeriodicTask__inherit__graph.map @@ -1,14 +1,14 @@ - - - - - - - - - + + + + + + + + + - - + + diff --git a/classutil_1_1PeriodicTask__inherit__graph.md5 b/classutil_1_1PeriodicTask__inherit__graph.md5 index 975d5a50..50bfedf0 100644 --- a/classutil_1_1PeriodicTask__inherit__graph.md5 +++ b/classutil_1_1PeriodicTask__inherit__graph.md5 @@ -1 +1 @@ -28341a5bdeafff15789ae4bb06b1ed7c \ No newline at end of file +4fb3296b5eb068d5e4d4510e248349f3 \ No newline at end of file diff --git a/classutil_1_1PeriodicTask__inherit__graph.png b/classutil_1_1PeriodicTask__inherit__graph.png index 6ff0e21d..83153dfb 100644 Binary files a/classutil_1_1PeriodicTask__inherit__graph.png and b/classutil_1_1PeriodicTask__inherit__graph.png differ diff --git a/classutil_1_1RAIIHelper-members.html b/classutil_1_1RAIIHelper-members.html index 1e2b180c..772b917b 100644 --- a/classutil_1_1RAIIHelper-members.html +++ b/classutil_1_1RAIIHelper-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@ - + + + +
util::RAIIHelper Member List
@@ -97,7 +110,8 @@
+ diff --git a/classutil_1_1RAIIHelper.html b/classutil_1_1RAIIHelper.html index 504aa5b3..57b1c556 100644 --- a/classutil_1_1RAIIHelper.html +++ b/classutil_1_1RAIIHelper.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): util::RAIIHelper Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -175,7 +188,8 @@

+

diff --git a/classutil_1_1ScopedTimer-members.html b/classutil_1_1ScopedTimer-members.html index 1165c9b3..7b1e7978 100644 --- a/classutil_1_1ScopedTimer-members.html +++ b/classutil_1_1ScopedTimer-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
util::ScopedTimer Member List
@@ -96,7 +109,8 @@
+ diff --git a/classutil_1_1ScopedTimer.html b/classutil_1_1ScopedTimer.html index 849b44f8..ddcec5b1 100644 --- a/classutil_1_1ScopedTimer.html +++ b/classutil_1_1ScopedTimer.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): util::ScopedTimer Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -146,7 +159,7 @@

util::ScopedTimer::ScopedTimer ( - ) + ) @@ -167,7 +180,7 @@

std::chrono::microseconds util::ScopedTimer::elapsedTime ( - ) + ) const @@ -185,7 +198,8 @@

+

diff --git a/classutil_1_1Watchdog-members.html b/classutil_1_1Watchdog-members.html index 4e43ec3c..4be406fc 100644 --- a/classutil_1_1Watchdog-members.html +++ b/classutil_1_1Watchdog-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
util::Watchdog< Clock > Member List
@@ -99,7 +112,8 @@
+ diff --git a/classutil_1_1Watchdog.html b/classutil_1_1Watchdog.html index fd156ad9..15f46507 100644 --- a/classutil_1_1Watchdog.html +++ b/classutil_1_1Watchdog.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): util::Watchdog< Clock > Class Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -166,22 +179,22 @@

util::Watchdog< Clock >::Watchdog ( - const std::string & name, + const std::string & name, - std::chrono::milliseconds duration, + std::chrono::milliseconds duration, - const std::function< void()> & callback, + const std::function< void()> & callback, - bool keepCallingOnDeath = false ) + bool keepCallingOnDeath = false ) @@ -218,17 +231,17 @@

util::Watchdog< Clock >::Watchdog ( - std::chrono::milliseconds duration, + std::chrono::milliseconds duration, - const std::function< void()> & callback, + const std::function< void()> & callback, - bool keepCallingOnDeath = false ) + bool keepCallingOnDeath = false ) @@ -265,7 +278,7 @@

void util::Watchdog< Clock >::feed ( - ) + ) @@ -287,7 +300,8 @@

+

diff --git a/classutil_1_1impl_1_1Notifiable-members.html b/classutil_1_1impl_1_1Notifiable-members.html index 1a7a3699..34c1c442 100644 --- a/classutil_1_1impl_1_1Notifiable-members.html +++ b/classutil_1_1impl_1_1Notifiable-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
util::impl::Notifiable Member List
@@ -93,7 +106,8 @@
+ diff --git a/classutil_1_1impl_1_1Notifiable.html b/classutil_1_1impl_1_1Notifiable.html index 055395b6..c7f057ea 100644 --- a/classutil_1_1impl_1_1Notifiable.html +++ b/classutil_1_1impl_1_1Notifiable.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): util::impl::Notifiable Class Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -94,32 +107,28 @@
Inheritance graph
- - - - - - - - - - - - - - - - - - - - - - - - - - + + + + + + + + + + + + + + + + + + + + + +
[legend]
@@ -141,7 +150,7 @@

virtual void util::impl::Notifiable::notify

- +
())
@@ -162,7 +171,8 @@

+

diff --git a/classutil_1_1impl_1_1Notifiable__inherit__graph.map b/classutil_1_1impl_1_1Notifiable__inherit__graph.map index 9dd1101d..0765862a 100644 --- a/classutil_1_1impl_1_1Notifiable__inherit__graph.map +++ b/classutil_1_1impl_1_1Notifiable__inherit__graph.map @@ -1,28 +1,24 @@ - - - - - - - - - - - - - - - - - - - - - - - - - - + + + + + + + + + + + + + + + + + + + + + + diff --git a/classutil_1_1impl_1_1Notifiable__inherit__graph.md5 b/classutil_1_1impl_1_1Notifiable__inherit__graph.md5 index bddbbdd0..54d052f4 100644 --- a/classutil_1_1impl_1_1Notifiable__inherit__graph.md5 +++ b/classutil_1_1impl_1_1Notifiable__inherit__graph.md5 @@ -1 +1 @@ -4cecdad8100b242affca1c205c9129d5 \ No newline at end of file +c97ae203095ae9e386acd4e099be2213 \ No newline at end of file diff --git a/classutil_1_1impl_1_1Notifiable__inherit__graph.png b/classutil_1_1impl_1_1Notifiable__inherit__graph.png index de5ea267..f18d9fee 100644 Binary files a/classutil_1_1impl_1_1Notifiable__inherit__graph.png and b/classutil_1_1impl_1_1Notifiable__inherit__graph.png differ diff --git a/classutil_1_1latch-members.html b/classutil_1_1latch-members.html index 28499715..dbc7e4ad 100644 --- a/classutil_1_1latch-members.html +++ b/classutil_1_1latch-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
util::latch Member List
@@ -99,7 +112,8 @@
+ diff --git a/classutil_1_1latch.html b/classutil_1_1latch.html index da24a09c..cf83f16c 100644 --- a/classutil_1_1latch.html +++ b/classutil_1_1latch.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): util::latch Class Reference + + @@ -39,23 +41,33 @@ - + + + +
diff --git a/classvideo_1_1H264Encoder-members.html b/classvideo_1_1H264Encoder-members.html index b897faec..5c35934d 100644 --- a/classvideo_1_1H264Encoder-members.html +++ b/classvideo_1_1H264Encoder-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
video::H264Encoder Member List
@@ -94,7 +107,8 @@
+ diff --git a/classvideo_1_1H264Encoder.html b/classvideo_1_1H264Encoder.html index 93fac872..d395c537 100644 --- a/classvideo_1_1H264Encoder.html +++ b/classvideo_1_1H264Encoder.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): video::H264Encoder Class Reference + + @@ -39,23 +41,33 @@ - + + + +
diff --git a/core_8h_source.html b/core_8h_source.html index 5fa8260c..3fa7361a 100644 --- a/core_8h_source.html +++ b/core_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/utils/core.h Source File + + @@ -39,18 +41,23 @@
- + + @@ -87,6 +94,7 @@
+
core.h
@@ -185,7 +193,8 @@
+ diff --git a/data_8h_source.html b/data_8h_source.html index 4dfa49bf..c19b2c77 100644 --- a/data_8h_source.html +++ b/data_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/world_interface/data.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
data.h
@@ -98,138 +106,144 @@
5#include <bitset>
6#include <chrono>
7#include <optional>
-
8#include <type_traits>
-
9#include <vector>
-
10
-
11#include <frozen/string.h>
-
12#include <frozen/unordered_map.h>
-
13#include <frozen/unordered_set.h>
-
14
-
15// forward declare cv::Mat instead of importing OpenCV
-
16// we do this to avoid unnecessarily including OpenCV in all build targets
-
17namespace cv {
-
18class Mat;
-
19}
-
20
-
25namespace robot::types {
-
26
-
28using dataclock = std::chrono::steady_clock;
- -
31
-
32template <typename T>
-
33class DataPoint;
-
34
- -
41
- - -
46
-
-
48enum class indication_t {
-
49 off,
-
50 autonomous,
-
51 teleop,
-
52 arrivedAtDest
-
53};
+
8#include <stdexcept>
+
9#include <type_traits>
+
10#include <vector>
+
11
+
12#include <frozen/string.h>
+
13#include <frozen/unordered_map.h>
+
14#include <frozen/unordered_set.h>
+
15
+
16// forward declare cv::Mat instead of importing OpenCV
+
17// we do this to avoid unnecessarily including OpenCV in all build targets
+
18namespace cv {
+
19class Mat;
+
20}
+
21
+
26namespace robot::types {
+
27
+
29using dataclock = std::chrono::steady_clock;
+ +
32
+
33template <typename T>
+
34class DataPoint;
+
35
+ +
42
+ + +
47
+
+
49enum class indication_t {
+
50 off,
+
51 autonomous,
+
52 teleop,
+
53 arrivedAtDest
+
54};
-
54
-
-
56enum class motorid_t {
-
57 frontLeftWheel,
-
58 frontRightWheel,
-
59 rearLeftWheel,
-
60 rearRightWheel,
-
61 armBase,
-
62 shoulder,
-
63 elbow,
-
64 forearm,
-
65 wrist,
-
66 hand,
-
67 activeSuspension
-
68};
+
55
+
+
57enum class motorid_t {
+
58 frontLeftWheel,
+
59 frontRightWheel,
+
60 rearLeftWheel,
+
61 rearRightWheel,
+
62 armBase,
+
63 shoulder,
+
64 elbow,
+
65 forearm,
+
66 wrist,
+
67 hand,
+
68 activeSuspension
+
69};
-
69
-
- -
72 none,
-
73 arm,
-
74 armServo,
-
75 scienceStation,
-
76 lidar
-
77};
+
70
+
+ +
73 none,
+
74 arm,
+
75 armServo,
+
76 scienceStation,
+
77 lidar
+
78};
-
78
-
79enum class jointid_t {
-
80 armBase,
-
81 shoulder,
-
82 elbow,
-
83 forearm,
-
84 wrist,
-
85 hand,
-
86 activeSuspension,
-
87 ikForward,
-
88 ikUp
-
89};
-
90
-
91constexpr auto all_jointid_t = frozen::make_unordered_set<jointid_t>(
-
92 {jointid_t::armBase, jointid_t::shoulder, jointid_t::elbow, jointid_t::forearm,
-
93 jointid_t::wrist, jointid_t::hand, jointid_t::activeSuspension, jointid_t::ikForward,
-
94 jointid_t::ikUp});
-
95
-
96constexpr auto name_to_jointid = frozen::make_unordered_map<frozen::string, jointid_t>(
-
97 {{"armBase", jointid_t::armBase},
-
98 {"shoulder", jointid_t::shoulder},
-
99 {"elbow", jointid_t::elbow},
-
100 {"forearm", jointid_t::forearm},
-
101 {"wrist", jointid_t::wrist},
-
102 {"hand", jointid_t::hand},
-
103 {"activeSuspension", jointid_t::activeSuspension},
-
104 {"ikForward", jointid_t::ikForward},
-
105 {"ikUp", jointid_t::ikUp}});
-
106
-
112template <typename T>
-
- -
114public:
-
118 DataPoint() : datapoint() {}
-
119
-
125 DataPoint(T data) : DataPoint(dataclock::now(), data) {}
-
126
-
133 DataPoint(datatime_t time, T data) : datapoint({time, data}) {}
-
134
-
-
141 operator T() const {
-
142 return getData();
-
143 }
+
79
+
80enum class jointid_t {
+
81 armBase,
+
82 shoulder,
+
83 elbow,
+
84 forearm,
+
85 wrist,
+
86 hand,
+
87 activeSuspension,
+
88 ikForward,
+
89 ikUp
+
90};
+
91
+
92constexpr auto all_jointid_t = frozen::make_unordered_set<jointid_t>(
+
93 {jointid_t::armBase, jointid_t::shoulder, jointid_t::elbow, jointid_t::forearm,
+
94 jointid_t::wrist, jointid_t::hand, jointid_t::activeSuspension, jointid_t::ikForward,
+
95 jointid_t::ikUp});
+
96
+
97constexpr auto name_to_jointid = frozen::make_unordered_map<frozen::string, jointid_t>(
+
98 {{"armBase", jointid_t::armBase},
+
99 {"shoulder", jointid_t::shoulder},
+
100 {"elbow", jointid_t::elbow},
+
101 {"forearm", jointid_t::forearm},
+
102 {"wrist", jointid_t::wrist},
+
103 {"hand", jointid_t::hand},
+
104 {"activeSuspension", jointid_t::activeSuspension},
+
105 {"ikForward", jointid_t::ikForward},
+
106 {"ikUp", jointid_t::ikUp}});
+
107
+
+ +
109public:
+
110 bad_datapoint_access() : std::runtime_error("bad_datapoint_access") {}
+
111};
-
144
-
-
150 operator bool() const {
-
151 return isValid();
-
152 }
+
112
+
118template <typename T>
+
+ +
120public:
+
124 DataPoint() : datapoint() {}
+
125
+
131 DataPoint(T data) : DataPoint(dataclock::now(), data) {}
+
132
+
139 DataPoint(datatime_t time, T data) : datapoint({time, data}) {}
+
140
+
+
146 operator bool() const {
+
147 return isValid();
+
148 }
-
153
-
-
161 bool isFresh(std::chrono::milliseconds duration) const {
-
162 return isValid() && dataclock::now() - duration <= getTime();
-
163 }
+
149
+
+
157 bool isFresh(std::chrono::milliseconds duration) const {
+
158 return isValid() && dataclock::now() - duration <= getTime();
+
159 }
-
164
-
-
170 bool isValid() const {
-
171 return datapoint.has_value();
-
172 }
+
160
+
+
166 bool isValid() const {
+
167 return datapoint.has_value();
+
168 }
-
173
-
- -
181 return datapoint.value().first;
-
182 }
+
169
+
+ +
177 return datapoint.value().first;
+
178 }
-
183
-
-
190 T getData() const {
-
191 return datapoint.value().second;
+
179
+
+
186 T getData() const {
+
187 if (isValid()) {
+
188 return datapoint.value().second;
+
189 } else {
+
190 throw bad_datapoint_access();
+
191 }
192 }
193
@@ -289,6 +303,7 @@
308} // namespace util
+ @@ -296,16 +311,17 @@ + -
Represents data measured using a sensor at a given time.
Definition data.h:113
-
bool isFresh(std::chrono::milliseconds duration) const
Check if this measurement was taken recently.
Definition data.h:161
-
DataPoint(T data)
Construct a new DataPoint object, measured now.
Definition data.h:125
-
T getData() const
Get the value of this data point.
Definition data.h:190
-
DataPoint(datatime_t time, T data)
Construct a new DataPoint object, measured at the given time.
Definition data.h:133
-
datatime_t getTime() const
Get the time at which the measurement was taken.
Definition data.h:180
-
bool isValid() const
Check if this measurement is valid.
Definition data.h:170
-
DataPoint()
Construct an invalid DataPoint, holding no data.
Definition data.h:118
+
Represents data measured using a sensor at a given time.
Definition data.h:119
+
bool isFresh(std::chrono::milliseconds duration) const
Check if this measurement was taken recently.
Definition data.h:157
+
DataPoint(T data)
Construct a new DataPoint object, measured now.
Definition data.h:131
+
T getData() const
Get the value of this data point.
Definition data.h:186
+
DataPoint(datatime_t time, T data)
Construct a new DataPoint object, measured at the given time.
Definition data.h:139
+
datatime_t getTime() const
Get the time at which the measurement was taken.
Definition data.h:176
+
bool isValid() const
Check if this measurement is valid.
Definition data.h:166
+
DataPoint()
Construct an invalid DataPoint, holding no data.
Definition data.h:124
DataPoint< std::invoke_result_t< F, T > > transform(const F &f)
Transforms the data in this datapoint by the given function.
Definition data.h:215
T getDataOrElse(T defaultData)
Get the value of this data point, defaulting to a given value if this data point is invalid.
Definition data.h:201
A class that represents limit switches from a specific motor.
Definition data.h:241
@@ -315,21 +331,23 @@
bool isAnyOpen()
Check if any index is open.
Definition data.cpp:19
bool isClosed(size_t idx)
Check if the given index is closed.
Definition data.cpp:11
bool isOpen(size_t idx)
Check if the given index is open.
Definition data.cpp:7
+
none
Types for use in the world interface.
Definition data.cpp:3
-
indication_t
An indication enum, used to command the LED to flash different signals.
Definition data.h:48
-
std::string CameraID
The type of a camera id.
Definition data.h:45
-
motorid_t
The motors on the robot.
Definition data.h:56
-
mountedperipheral_t
the mounted peripheral on the robot.
Definition data.h:71
-
std::chrono::steady_clock dataclock
The clock used for time measurements for data.
Definition data.h:28
+
indication_t
An indication enum, used to command the LED to flash different signals.
Definition data.h:49
+
std::string CameraID
The type of a camera id.
Definition data.h:46
+
motorid_t
The motors on the robot.
Definition data.h:57
+
mountedperipheral_t
the mounted peripheral on the robot.
Definition data.h:72
+
std::chrono::steady_clock dataclock
The clock used for time measurements for data.
Definition data.h:29
constexpr size_t N_LIMIT_SWITCH
The maximum number of limit switches associated with any motor.
Definition data.h:233
A collection of utility functions and classes with common use-cases.
Definition core.cpp:3
std::string to_string(const T &val)
Convert the given value to a string.
Definition core.h:51
+
diff --git a/dir_004e800ee3ba15138b2f73b7599c3c7a.html b/dir_004e800ee3ba15138b2f73b7599c3c7a.html index d53dffe9..0d101fef 100644 --- a/dir_004e800ee3ba15138b2f73b7599c3c7a.html +++ b/dir_004e800ee3ba15138b2f73b7599c3c7a.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/CAN Directory Reference + + @@ -39,23 +41,33 @@
- + + +
+
CAN Directory Reference
@@ -108,7 +121,8 @@
+
diff --git a/dir_02a4bb012d47d837a11eca835504daff.html b/dir_02a4bb012d47d837a11eca835504daff.html index d282d0d3..eee13c5d 100644 --- a/dir_02a4bb012d47d837a11eca835504daff.html +++ b/dir_02a4bb012d47d837a11eca835504daff.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/network/websocket Directory Reference + + @@ -39,23 +41,33 @@
- + + +
+
websocket Directory Reference
@@ -106,7 +119,8 @@
+
diff --git a/dir_03c96a697a60feff0ebb9f02e338fa5d.html b/dir_03c96a697a60feff0ebb9f02e338fa5d.html index a6c9cf5c..6027b96a 100644 --- a/dir_03c96a697a60feff0ebb9f02e338fa5d.html +++ b/dir_03c96a697a60feff0ebb9f02e338fa5d.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/gps/usb_gps Directory Reference + + @@ -39,23 +41,33 @@
- + + +
+
usb_gps Directory Reference
@@ -104,7 +117,8 @@
+
diff --git a/dir_045b20ae535c37a01669b93c951b2cf1.html b/dir_045b20ae535c37a01669b93c951b2cf1.html index 25d24ab6..4cf4cb50 100644 --- a/dir_045b20ae535c37a01669b93c951b2cf1.html +++ b/dir_045b20ae535c37a01669b93c951b2cf1.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): tests/camera Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
camera Directory Reference
@@ -98,7 +111,8 @@
+ diff --git a/dir_158ca147e218bea511d3b70ff49380aa.html b/dir_158ca147e218bea511d3b70ff49380aa.html index e4943f14..897b3169 100644 --- a/dir_158ca147e218bea511d3b70ff49380aa.html +++ b/dir_158ca147e218bea511d3b70ff49380aa.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/gps Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
gps Directory Reference
@@ -113,7 +126,8 @@
+ diff --git a/dir_164724f2049c96ee2d1b69e829ddec4e.html b/dir_164724f2049c96ee2d1b69e829ddec4e.html index 1bbe66b4..d6df5368 100644 --- a/dir_164724f2049c96ee2d1b69e829ddec4e.html +++ b/dir_164724f2049c96ee2d1b69e829ddec4e.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/autonomous Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
autonomous Directory Reference
@@ -104,7 +117,8 @@
+ diff --git a/dir_1bc13244e26df1e1f069a1fd18e36da3.html b/dir_1bc13244e26df1e1f069a1fd18e36da3.html index b09db4e2..e0f151fd 100644 --- a/dir_1bc13244e26df1e1f069a1fd18e36da3.html +++ b/dir_1bc13244e26df1e1f069a1fd18e36da3.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/filters Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
filters Directory Reference
@@ -114,7 +127,8 @@
+ diff --git a/dir_1e1245ae52d485cb7d8112a201289c20.html b/dir_1e1245ae52d485cb7d8112a201289c20.html index 702f6bdd..0a8955ff 100644 --- a/dir_1e1245ae52d485cb7d8112a201289c20.html +++ b/dir_1e1245ae52d485cb7d8112a201289c20.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/world_interface Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
world_interface Directory Reference
@@ -114,7 +127,8 @@
+ diff --git a/dir_313caf1132e152dd9b58bea13a4052ca.html b/dir_313caf1132e152dd9b58bea13a4052ca.html index dd5b8c7f..7e9856e8 100644 --- a/dir_313caf1132e152dd9b58bea13a4052ca.html +++ b/dir_313caf1132e152dd9b58bea13a4052ca.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/utils Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
utils Directory Reference
@@ -122,7 +135,8 @@
+ diff --git a/dir_34519bff5ae72130fe71a8620cbf1fc0.html b/dir_34519bff5ae72130fe71a8620cbf1fc0.html index ab33a186..6de7305b 100644 --- a/dir_34519bff5ae72130fe71a8620cbf1fc0.html +++ b/dir_34519bff5ae72130fe71a8620cbf1fc0.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/camera Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
camera Directory Reference
@@ -108,7 +121,8 @@
+ diff --git a/dir_44ce8db33bebb5b2168a1d2beb49f830.html b/dir_44ce8db33bebb5b2168a1d2beb49f830.html index 83c9861f..c3fbc3c2 100644 --- a/dir_44ce8db33bebb5b2168a1d2beb49f830.html +++ b/dir_44ce8db33bebb5b2168a1d2beb49f830.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): tests/util Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
util Directory Reference
@@ -98,7 +111,8 @@
+ diff --git a/dir_4ba9f2ff9977d089d905fe71cbfd593d.html b/dir_4ba9f2ff9977d089d905fe71cbfd593d.html index 9d3cc44b..99e2b0a7 100644 --- a/dir_4ba9f2ff9977d089d905fe71cbfd593d.html +++ b/dir_4ba9f2ff9977d089d905fe71cbfd593d.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/gps/dummy Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
dummy Directory Reference
@@ -98,7 +111,8 @@
+ diff --git a/dir_59425e443f801f1f2fd8bbe4959a3ccf.html b/dir_59425e443f801f1f2fd8bbe4959a3ccf.html index c9828ad5..5e8d25c2 100644 --- a/dir_59425e443f801f1f2fd8bbe4959a3ccf.html +++ b/dir_59425e443f801f1f2fd8bbe4959a3ccf.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): tests Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
tests Directory Reference
@@ -107,7 +120,8 @@
+ diff --git a/dir_5d532859189d94b37937c3bee33a301a.html b/dir_5d532859189d94b37937c3bee33a301a.html index ed3c2b23..1a26cb1d 100644 --- a/dir_5d532859189d94b37937c3bee33a301a.html +++ b/dir_5d532859189d94b37937c3bee33a301a.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/kinematics Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
kinematics Directory Reference
@@ -118,7 +131,8 @@
+ diff --git a/dir_5e80d29b61c444378a543be4dd1414df.html b/dir_5e80d29b61c444378a543be4dd1414df.html index f450a416..8590d915 100644 --- a/dir_5e80d29b61c444378a543be4dd1414df.html +++ b/dir_5e80d29b61c444378a543be4dd1414df.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/commands Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
commands Directory Reference
@@ -106,7 +119,8 @@
+ diff --git a/dir_68267d1309a1af8e8297ef4c3efbcdba.html b/dir_68267d1309a1af8e8297ef4c3efbcdba.html index e9aa8ec0..c7c67047 100644 --- a/dir_68267d1309a1af8e8297ef4c3efbcdba.html +++ b/dir_68267d1309a1af8e8297ef4c3efbcdba.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
src Directory Reference
@@ -132,7 +145,8 @@
+ diff --git a/dir_6f541b91a7b696337954732fda281f8e.html b/dir_6f541b91a7b696337954732fda281f8e.html index 50be81c6..0402e1a1 100644 --- a/dir_6f541b91a7b696337954732fda281f8e.html +++ b/dir_6f541b91a7b696337954732fda281f8e.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): tests/control Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
control Directory Reference
@@ -98,7 +111,8 @@
+ diff --git a/dir_7848a2c64cfc47098440f234227357ec.html b/dir_7848a2c64cfc47098440f234227357ec.html index 790cd246..b4b05952 100644 --- a/dir_7848a2c64cfc47098440f234227357ec.html +++ b/dir_7848a2c64cfc47098440f234227357ec.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/ardupilot Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
ardupilot Directory Reference
@@ -106,7 +119,8 @@
+ diff --git a/dir_7fb95411a1fca4f352323c4983e8f4e8.html b/dir_7fb95411a1fca4f352323c4983e8f4e8.html index 26fc626e..1e35649d 100644 --- a/dir_7fb95411a1fca4f352323c4983e8f4e8.html +++ b/dir_7fb95411a1fca4f352323c4983e8f4e8.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/world_interface/motor Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
motor Directory Reference
@@ -108,7 +121,8 @@
+ diff --git a/dir_89f12bade8d9fea319d71e72377b803c.html b/dir_89f12bade8d9fea319d71e72377b803c.html index 210f4b07..3dc161a6 100644 --- a/dir_89f12bade8d9fea319d71e72377b803c.html +++ b/dir_89f12bade8d9fea319d71e72377b803c.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/ar Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
ar Directory Reference
@@ -112,7 +125,8 @@
+ diff --git a/dir_997de5e7247c3cac6f700a4059053ecc.html b/dir_997de5e7247c3cac6f700a4059053ecc.html index b4794e42..271cb579 100644 --- a/dir_997de5e7247c3cac6f700a4059053ecc.html +++ b/dir_997de5e7247c3cac6f700a4059053ecc.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): tests/gps Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
gps Directory Reference
@@ -98,7 +111,8 @@
+ diff --git a/dir_9ab17fd7f07b28ef7164bcc825435f04.html b/dir_9ab17fd7f07b28ef7164bcc825435f04.html index cf0ee490..119233c7 100644 --- a/dir_9ab17fd7f07b28ef7164bcc825435f04.html +++ b/dir_9ab17fd7f07b28ef7164bcc825435f04.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/base64 Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
base64 Directory Reference
@@ -106,7 +119,8 @@
+ diff --git a/dir_ac8a21e106a767b81ce76ba376d13b0e.html b/dir_ac8a21e106a767b81ce76ba376d13b0e.html index 9e33a8b0..c74e9d19 100644 --- a/dir_ac8a21e106a767b81ce76ba376d13b0e.html +++ b/dir_ac8a21e106a767b81ce76ba376d13b0e.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): tests/kinematics Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
kinematics Directory Reference
@@ -98,7 +111,8 @@
+ diff --git a/dir_b81b067251166617f9d0a8c0cfc3a4a9.html b/dir_b81b067251166617f9d0a8c0cfc3a4a9.html index d30d41f9..5cd9ae75 100644 --- a/dir_b81b067251166617f9d0a8c0cfc3a4a9.html +++ b/dir_b81b067251166617f9d0a8c0cfc3a4a9.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/control Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
control Directory Reference
@@ -112,7 +125,8 @@
+ diff --git a/dir_c7edc1e19fb8dca7509791209fe6e1b6.html b/dir_c7edc1e19fb8dca7509791209fe6e1b6.html index e3cb26e7..097a9c17 100644 --- a/dir_c7edc1e19fb8dca7509791209fe6e1b6.html +++ b/dir_c7edc1e19fb8dca7509791209fe6e1b6.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): tests/filters Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
filters Directory Reference
@@ -98,7 +111,8 @@
+ diff --git a/dir_c93feeca1b1d7b4a94cd5de0fef97756.html b/dir_c93feeca1b1d7b4a94cd5de0fef97756.html index 14643190..1137bac4 100644 --- a/dir_c93feeca1b1d7b4a94cd5de0fef97756.html +++ b/dir_c93feeca1b1d7b4a94cd5de0fef97756.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): tests/commands Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
commands Directory Reference
@@ -98,7 +111,8 @@
+ diff --git a/dir_e97914cf306b9746d2b591eedf95e05b.html b/dir_e97914cf306b9746d2b591eedf95e05b.html index 015012d4..f108e1b8 100644 --- a/dir_e97914cf306b9746d2b591eedf95e05b.html +++ b/dir_e97914cf306b9746d2b591eedf95e05b.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/video Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
video Directory Reference
@@ -106,7 +119,8 @@
+ diff --git a/dir_fc4c7f03e1a69a98c370fae55a743828.html b/dir_fc4c7f03e1a69a98c370fae55a743828.html index b9888908..31702ffa 100644 --- a/dir_fc4c7f03e1a69a98c370fae55a743828.html +++ b/dir_fc4c7f03e1a69a98c370fae55a743828.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/network Directory Reference + + @@ -39,23 +41,33 @@ - + + + +
network Directory Reference
@@ -114,7 +127,8 @@
+ diff --git a/doc_8h_source.html b/doc_8h_source.html index 640d7e87..a1e8426e 100644 --- a/doc_8h_source.html +++ b/doc_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/utils/doc.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
doc.h
@@ -100,7 +108,8 @@
+ diff --git a/doxygen.css b/doxygen.css index 7b7d851b..209912c7 100644 --- a/doxygen.css +++ b/doxygen.css @@ -1,4 +1,4 @@ -/* The standard CSS for doxygen 1.10.0*/ +/* The standard CSS for doxygen 1.11.0*/ html { /* page base colors */ @@ -657,7 +657,24 @@ dl.el { margin-left: -1cm; } +ul.check { + list-style:none; + text-indent: -16px; + padding-left: 38px; +} +li.unchecked:before { + content: "\2610\A0"; +} +li.checked:before { + content: "\2611\A0"; +} + +ol { + text-indent: 0px; +} + ul { + text-indent: 0px; overflow: visible; } @@ -1614,7 +1631,7 @@ dl.note { border-color: #D0C000; } -dl.warning, dl.attention { +dl.warning, dl.attention, dl.important { margin-left: -7px; padding-left: 3px; border-left: 4px solid; @@ -1662,7 +1679,7 @@ dl.bug dt a, dl.deprecated dt a, dl.todo dt a, dl.test a { font-weight: bold !important; } -dl.warning, dl.attention, dl.note, dl.deprecated, dl.bug, +dl.warning, dl.attention, dl.important, dl.note, dl.deprecated, dl.bug, dl.invariant, dl.pre, dl.post, dl.todo, dl.test, dl.remark { padding: 10px; margin: 10px 0px; @@ -1675,13 +1692,13 @@ dl.section dd { margin-bottom: 2px; } -dl.warning, dl.attention { +dl.warning, dl.attention, dl.important { background: var(--warning-color-bg); border-left: 8px solid var(--warning-color-hl); color: var(--warning-color-text); } -dl.warning dt, dl.attention dt { +dl.warning dt, dl.attention dt, dl.important dt { color: var(--warning-color-hl); } @@ -1739,7 +1756,9 @@ dl.deprecated dt a { color: var(--deprecated-color-hl) !important; } -dl.section dd, dl.bug dd, dl.deprecated dd, dl.todo dd, dl.test dd { +dl.note dd, dl.warning dd, dl.pre dd, dl.post dd, +dl.remark dd, dl.attention dd, dl.important dd, dl.invariant dd, +dl.bug dd, dl.deprecated dd, dl.todo dd, dl.test dd { margin-inline-start: 0px; } diff --git a/doxygen_crawl.html b/doxygen_crawl.html index cd37ed90..50591626 100644 --- a/doxygen_crawl.html +++ b/doxygen_crawl.html @@ -4,7 +4,7 @@ Validator / crawler helper - + @@ -207,6 +207,8 @@ + + @@ -385,5 +387,725 @@ + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + + diff --git a/dynsections.js b/dynsections.js index 8f493264..b05f4c8d 100644 --- a/dynsections.js +++ b/dynsections.js @@ -23,6 +23,10 @@ @licend The above is the entire license notice for the JavaScript code in this file */ +function toggleVisibility(linkObj) { + return dynsection.toggleVisibility(linkObj); +} + let dynsection = { // helper function diff --git a/encoder_8hpp_source.html b/encoder_8hpp_source.html index b862abc7..7ef744f5 100644 --- a/encoder_8hpp_source.html +++ b/encoder_8hpp_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/video/encoder.hpp Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
encoder.hpp
@@ -139,7 +147,8 @@
+ diff --git a/files.html b/files.html index 1dca1d3b..295ceb62 100644 --- a/files.html +++ b/files.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): File List + + @@ -39,24 +41,35 @@ - + + +
+
+
diff --git a/functions.html b/functions.html index 9be70a15..ce2210bb 100644 --- a/functions.html +++ b/functions.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Class Members + + @@ -39,24 +41,35 @@
- + + +
+
- a -

    + diff --git a/functions_b.html b/functions_b.html index 3817c024..de1fa1c6 100644 --- a/functions_b.html +++ b/functions_b.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Class Members + + @@ -39,24 +41,35 @@ - + + +
    +
    - b -

+ diff --git a/functions_w.html b/functions_w.html index 517eb1d4..d57af4f5 100644 --- a/functions_w.html +++ b/functions_w.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Class Members + + @@ -39,24 +41,35 @@ - + + +
+
- w -
+
diff --git a/functions_z.html b/functions_z.html index 4e889af9..3c60ace8 100644 --- a/functions_z.html +++ b/functions_z.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Class Members + + @@ -39,24 +41,35 @@ - + + +
+
- z -
+
diff --git a/functions_~.html b/functions_~.html index fc6b8283..05d283ad 100644 --- a/functions_~.html +++ b/functions_~.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Class Members + + @@ -39,24 +41,35 @@ - + + +
+
- ~ -
+
diff --git a/gps__util_8h_source.html b/gps__util_8h_source.html index 9ea25ad0..56eab0a5 100644 --- a/gps__util_8h_source.html +++ b/gps__util_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/gps/gps_util.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
gps_util.h
@@ -153,7 +161,8 @@
+ diff --git a/graph_legend.html b/graph_legend.html index b31b38b5..a82cadab 100644 --- a/graph_legend.html +++ b/graph_legend.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Graph Legend + + @@ -39,24 +41,35 @@ - + + +
+
+
diff --git a/group__ar.html b/group__ar.html index a6e9569e..bb770207 100644 --- a/group__ar.html +++ b/group__ar.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Ar + + @@ -39,24 +41,35 @@
- + + +
+
+
diff --git a/group__camera.html b/group__camera.html index 925009dd..7abf14e5 100644 --- a/group__camera.html +++ b/group__camera.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Camera Access + + @@ -39,24 +41,35 @@
- + + +
+
Camera Access
+ +

This module provides an interface for defining and accessing the different cameras attached to the rover. +More...

@@ -163,7 +179,7 @@

Classes

 

Detailed Description

-

This module provides an interface for defining and accessing the different cameras attached to the rover.

+

This module provides an interface for defining and accessing the different cameras attached to the rover.

Cameras can be defined in YAML files (see Camera Configuration) and opened using these files at runtime (see Camera::openFromConfigFile()).

Function Documentation

@@ -175,17 +191,17 @@

void cam::read ( - const cv::FileNode & node, + const cv::FileNode & node, - CameraParams & params, + CameraParams & params, - const CameraParams & default_value = CameraParams() ) + const CameraParams & default_value = CameraParams() )

@@ -237,12 +253,12 @@

void cam::write ( - cv::FileStorage & fs, + cv::FileStorage & fs, - const std::string & name, + const std::string & name, @@ -260,7 +276,8 @@

+

diff --git a/hierarchy.html b/hierarchy.html index e3aec824..122c87c4 100644 --- a/hierarchy.html +++ b/hierarchy.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Class Hierarchy + + @@ -39,24 +41,35 @@ - + + +
+
 Cnavtypes::eulerangles_t  Cstd::exception [external]  Ccam::invalid_camera_configException for errors in the camera configuration + Cstd::runtime_error [external] + Crobot::types::bad_datapoint_access  Ckinematics::ForwardArmKinematics< D, N >A class that calculates the forward kinematics of an arm  Ckinematics::ArmKinematics< 2, N >  Ckinematics::ArmKinematics< D, N >A class that combines the forward and inverse kinematics of an arm @@ -141,14 +156,14 @@  Cfilters::statespace::NoiseCovMat< stateDim, processNoiseDim, inputDim >  Cfilters::statespace::NoiseCovMat<-1, -1, -1 >Represents a square noise covariance matrix  Cutil::impl::Notifiable - Cutil::AsyncTask< std::chrono::steady_clock > + Cutil::AsyncTask< std::chrono::steady_clock > + Cutil::PeriodicTask< Clock >Implements a task that executes a function periodically + Cnet::mc::tasks::ArmIKTaskThis task sets the arm joint positions to track the current IK command + Cnet::mc::tasks::PowerRepeatTaskThis task is responsible for periodically resending setMotorPower commands to the motors + Cnet::mc::tasks::TelemReportTaskThis task periodically sends robot telemetry data to Mission Control  Cutil::PeriodicScheduler< std::chrono::steady_clock >  Cutil::AsyncTask< Clock >An abstract class that can be overridden to run long-running tasks and encapsulate task-related data  Cnet::mc::tasks::CameraStreamTaskThis task is responsible for sending the camera streams to Mission Control over websocket - Cutil::PeriodicTask< Clock >Implements a task that executes a function periodically - Cnet::mc::tasks::ArmIKTaskThis task sets the arm joint positions to track the current IK command - Cnet::mc::tasks::PowerRepeatTaskThis task is responsible for periodically resending setMotorPower commands to the motors - Cnet::mc::tasks::TelemReportTaskThis task periodically sends robot telemetry data to Mission Control  Cutil::PeriodicScheduler< Clock >Uses a single thread to periodically invoke callbacks at a given frequency  Cutil::PeriodicTask< Clock >Implements a task that executes a function periodically  Cutil::Watchdog< Clock >Implements a thread-safe watchdog @@ -180,7 +195,8 @@
+
diff --git a/index.html b/index.html index ae6e9d7d..3dab07b0 100644 --- a/index.html +++ b/index.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Main Page + + @@ -39,24 +41,35 @@ - + + +
+
+
diff --git a/inherit_graph_56.map b/inherit_graph_56.map index 70e5fc7f..c815c337 100644 --- a/inherit_graph_56.map +++ b/inherit_graph_56.map @@ -1,5 +1,9 @@ - + - + + + + + diff --git a/inherit_graph_56.md5 b/inherit_graph_56.md5 index 4aba577a..aa1d3c26 100644 --- a/inherit_graph_56.md5 +++ b/inherit_graph_56.md5 @@ -1 +1 @@ -7327a142d4ca0311fec2b6c109dfd4e0 \ No newline at end of file +76c9e6696faca33865fe6c2bd06e63d1 \ No newline at end of file diff --git a/inherit_graph_56.png b/inherit_graph_56.png index 6c4ce7b3..f4d1306e 100644 Binary files a/inherit_graph_56.png and b/inherit_graph_56.png differ diff --git a/inherit_graph_58.map b/inherit_graph_58.map index 50d20c4f..9fb0dc9c 100644 --- a/inherit_graph_58.map +++ b/inherit_graph_58.map @@ -1,24 +1,24 @@ - - - - - - - - - - - - - - - - - - - - - - + + + + + + + + + + + + + + + + + + + + + + diff --git a/inherit_graph_58.md5 b/inherit_graph_58.md5 index d4c80a39..e7f716d1 100644 --- a/inherit_graph_58.md5 +++ b/inherit_graph_58.md5 @@ -1 +1 @@ -c4b8494253f03d1351e8c924146d73dd \ No newline at end of file +0943b5422dbc6b917fc5bfdfcedbb8df \ No newline at end of file diff --git a/inherit_graph_58.png b/inherit_graph_58.png index 7e721a21..aac5d692 100644 Binary files a/inherit_graph_58.png and b/inherit_graph_58.png differ diff --git a/inherits.html b/inherits.html index e9201d4b..30b7cdfd 100644 --- a/inherits.html +++ b/inherits.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Class Hierarchy + + @@ -39,24 +41,35 @@
- + + +
+
- + - + + + + + @@ -404,28 +421,28 @@ - - - - - - - - - - - - - - - - - - - - - - + + + + + + + + + + + + + + + + + + + + + + @@ -452,7 +469,8 @@
+
diff --git a/json_8h_source.html b/json_8h_source.html index be3b3e67..4fd44de3 100644 --- a/json_8h_source.html +++ b/json_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/utils/json.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
json.h
@@ -127,7 +135,8 @@
+ diff --git a/math_8h_source.html b/math_8h_source.html index 470f0cde..f0bbf023 100644 --- a/math_8h_source.html +++ b/math_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/utils/math.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
math.h
@@ -110,7 +118,8 @@
+ diff --git a/md_StyleGuide.html b/md_StyleGuide.html index 0fb80cfe..49364ed6 100644 --- a/md_StyleGuide.html +++ b/md_StyleGuide.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Style Guide + + @@ -39,23 +41,33 @@ - + + +
+
Style Guide
@@ -158,7 +171,8 @@

+
diff --git a/menu.js b/menu.js index 717761d0..0fd1e990 100644 --- a/menu.js +++ b/menu.js @@ -22,7 +22,7 @@ @licend The above is the entire license notice for the JavaScript code in this file */ -function initMenu(relPath,searchEnabled,serverSide,searchPage,search) { +function initMenu(relPath,searchEnabled,serverSide,searchPage,search,treeview) { function makeTree(data,relPath) { let result=''; if ('children' in data) { @@ -91,7 +91,7 @@ function initMenu(relPath,searchEnabled,serverSide,searchPage,search) { let prevWidth = 0; if ($mainMenuState.length) { const initResizableIfExists = function() { - if (typeof initResizable==='function') initResizable(); + if (typeof initResizable==='function') initResizable(treeview); } // animate mobile menu $mainMenuState.change(function() { diff --git a/namespacecam.html b/namespacecam.html index beab8339..c20f921a 100644 --- a/namespacecam.html +++ b/namespacecam.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): cam Namespace Reference + + @@ -39,23 +41,33 @@ - + + +
+
Classes | @@ -185,7 +198,8 @@
+
diff --git a/namespacecan.html b/namespacecan.html index 9536862e..23b3a3da 100644 --- a/namespacecan.html +++ b/namespacecan.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): can Namespace Reference + + @@ -39,23 +41,33 @@ - + + +
+
Namespaces | @@ -94,7 +107,7 @@ - +

Namespaces

namespace  motor
namespace  motor
 Utilities for interacting with motor boards over a CAN interface.
 
@@ -314,12 +327,12 @@

callbackid_t can::addDeviceTelemetryCallback

- + - + @@ -430,7 +443,7 @@

robot::types::DataPoint< telemetry_t > can::getDeviceTelemetry

- + @@ -540,7 +553,7 @@

void can::initCAN

- +
(deviceid_t id, deviceid_t id,
telemtype_t telemType, telemtype_t telemType,
(deviceid_t id, deviceid_t id,
())
@@ -589,7 +602,7 @@

void can::pullDeviceTelemetry ( - deviceid_t id, + deviceid_t id, @@ -646,12 +659,12 @@

void can::scheduleTelemetryPull ( - deviceid_t id, + deviceid_t id, - telemtype_t telemType, + telemtype_t telemType, @@ -709,7 +722,7 @@

void can::unscheduleAllTelemetryPulls ( - ) + ) @@ -729,7 +742,7 @@

void can::unscheduleTelemetryPull ( - deviceid_t id, + deviceid_t id, @@ -754,7 +767,8 @@

+

diff --git a/namespacecan_1_1motor.html b/namespacecan_1_1motor.html index abfcb68d..108c1f6a 100644 --- a/namespacecan_1_1motor.html +++ b/namespacecan_1_1motor.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): can::motor Namespace Reference + + @@ -39,23 +41,33 @@
- + + +
+
Classes | @@ -169,7 +182,7 @@

callbackid_t can::motor::addLimitSwitchCallback ( - deviceserial_t serial, + deviceserial_t serial, @@ -201,7 +214,7 @@

void can::motor::emergencyStopMotors ( - ) + ) @@ -248,22 +261,22 @@

void can::motor::initEncoder ( - deviceserial_t serial, + deviceserial_t serial, - bool invertEncoder, + bool invertEncoder, - bool zeroEncoder, + bool zeroEncoder, - int32_t pulsesPerJointRev, + int32_t pulsesPerJointRev, @@ -323,27 +336,27 @@

void can::motor::initPotentiometer ( - deviceserial_t serial, + deviceserial_t serial, - int32_t posLo, + int32_t posLo, - int32_t posHi, + int32_t posHi, - uint16_t adcLo, + uint16_t adcLo, - uint16_t adcHi, + uint16_t adcHi, @@ -428,12 +441,12 @@

void can::motor::setLimitSwitchLimits ( - deviceserial_t serial, + deviceserial_t serial, - int32_t lo, + int32_t lo, @@ -465,7 +478,7 @@

void can::motor::setMotorMode ( - deviceserial_t serial, + deviceserial_t serial, @@ -495,17 +508,17 @@

void can::motor::setMotorPIDConstants ( - deviceserial_t serial, + deviceserial_t serial, - int32_t kP, + int32_t kP, - int32_t kI, + int32_t kI, @@ -540,7 +553,7 @@

void can::motor::setMotorPIDTarget ( - deviceserial_t serial, + deviceserial_t serial, @@ -571,7 +584,7 @@

void can::motor::setMotorPower ( - deviceserial_t serial, + deviceserial_t serial, @@ -601,7 +614,7 @@

void can::motor::setMotorPower ( - deviceserial_t serial, + deviceserial_t serial, @@ -632,12 +645,12 @@

void can::motor::setServoPos ( - deviceserial_t serial, + deviceserial_t serial, - uint8_t servoNum, + uint8_t servoNum, @@ -662,7 +675,8 @@

+

diff --git a/namespacefilters_1_1statespace.html b/namespacefilters_1_1statespace.html index f3f02edb..ae820d42 100644 --- a/namespacefilters_1_1statespace.html +++ b/namespacefilters_1_1statespace.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): filters::statespace Namespace Reference + + @@ -39,23 +41,33 @@
- + + +
+
Classes | @@ -158,12 +171,12 @@

void filters::statespace::continuousToDiscrete ( - Eigen::Matrix< double, numStates, numStates > & A, + Eigen::Matrix< double, numStates, numStates > & A, - Eigen::Matrix< double, numStates, numInputs > & B, + Eigen::Matrix< double, numStates, numInputs > & B, @@ -236,7 +249,7 @@

Eigen::Matrix< double, numStates, numStates > filters::statespace::discreteToContinuous ( - const Eigen::Matrix< double, numStates, numStates > & A, + const Eigen::Matrix< double, numStates, numStates > & A, @@ -275,12 +288,12 @@

void filters::statespace::discreteToContinuous ( - Eigen::Matrix< double, numStates, numStates > & A, + Eigen::Matrix< double, numStates, numStates > & A, - Eigen::Matrix< double, numStates, numInputs > & B, + Eigen::Matrix< double, numStates, numInputs > & B, @@ -319,7 +332,7 @@

Eigen::Matrix< double, numStates, numStates > filters::statespace::discretizeA ( - const Eigen::Matrix< double, numStates, numStates > & contA, + const Eigen::Matrix< double, numStates, numStates > & contA, @@ -358,22 +371,22 @@

void filters::statespace::discretizeAQ ( - const Eigen::Matrix< double, numStates, numStates > & contA, + const Eigen::Matrix< double, numStates, numStates > & contA, - const Eigen::Matrix< double, numStates, numStates > & contQ, + const Eigen::Matrix< double, numStates, numStates > & contQ, - Eigen::Matrix< double, numStates, numStates > & discA, + Eigen::Matrix< double, numStates, numStates > & discA, - Eigen::Matrix< double, numStates, numStates > & discQ, + Eigen::Matrix< double, numStates, numStates > & discQ, @@ -414,12 +427,12 @@

Eigen::Matrix< double, numStates, numStates > filters::statespace::discretizeQ ( - const Eigen::Matrix< double, numStates, numStates > & contA, + const Eigen::Matrix< double, numStates, numStates > & contA, - const Eigen::Matrix< double, numStates, numStates > & contQ, + const Eigen::Matrix< double, numStates, numStates > & contQ, @@ -459,7 +472,7 @@

Eigen::Matrix< double, numStates, numStates > filters::statespace::discretizeR ( - const Eigen::Matrix< double, numStates, numStates > & contR, + const Eigen::Matrix< double, numStates, numStates > & contR, @@ -490,7 +503,8 @@

+

diff --git a/namespacemembers.html b/namespacemembers.html index 3b379fc0..dd43ab0f 100644 --- a/namespacemembers.html +++ b/namespacemembers.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Namespace Members + + @@ -39,24 +41,35 @@
- + +
+
+
- w -
+
diff --git a/namespacemembers_enum.html b/namespacemembers_enum.html index 23733951..d63effa6 100644 --- a/namespacemembers_enum.html +++ b/namespacemembers_enum.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Namespace Members + + @@ -39,24 +41,35 @@ - + + +
+
+
diff --git a/namespacemembers_func.html b/namespacemembers_func.html index e3de6b92..5c00c3ca 100644 --- a/namespacemembers_func.html +++ b/namespacemembers_func.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Namespace Members + + @@ -39,24 +41,35 @@
- + + +
+
- w -
+
diff --git a/namespacemembers_type.html b/namespacemembers_type.html index 57399457..66929262 100644 --- a/namespacemembers_type.html +++ b/namespacemembers_type.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Namespace Members + + @@ -39,24 +41,35 @@ - + + +
+
+
diff --git a/namespacemembers_vars.html b/namespacemembers_vars.html index 17f3967a..987325c1 100644 --- a/namespacemembers_vars.html +++ b/namespacemembers_vars.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Namespace Members + + @@ -39,24 +41,35 @@
- + + +
+
+
diff --git a/namespacerobot.html b/namespacerobot.html index 7773ccdf..4b9f67b6 100644 --- a/namespacerobot.html +++ b/namespacerobot.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): robot Namespace Reference + + @@ -39,23 +41,33 @@
- + + +
+
Namespaces | @@ -95,7 +108,7 @@ - +

Namespaces

namespace  types
namespace  types
 Types for use in the world interface.
 
@@ -325,7 +338,7 @@

void robot::emergencyStop

- +
())
@@ -397,7 +410,7 @@

std::unordered_set< types::CameraID > robot::getCameras ( - ) + ) @@ -528,7 +541,7 @@

types::DataPoint< navtypes::pose_t > robot::getTruePose ( - ) + ) @@ -549,7 +562,7 @@

bool robot::gpsHasFix ( - ) + ) @@ -595,7 +608,7 @@

bool robot::hasNewCameraFrame ( - types::CameraID camera, + types::CameraID camera, @@ -653,7 +666,7 @@

types::DataPoint< navtypes::point_t > robot::readGPS ( - ) + ) @@ -674,7 +687,7 @@

types::DataPoint< Eigen::Quaterniond > robot::readIMU ( - ) + ) @@ -694,7 +707,7 @@

types::DataPoint< double > robot::readIMUHeading ( - ) + ) @@ -715,7 +728,7 @@

types::landmarks_t robot::readLandmarks ( - ) + ) @@ -736,7 +749,7 @@

double robot::setCmdVel ( - double dtheta, + double dtheta, @@ -792,7 +805,7 @@

void robot::setJointPos ( - robot::types::jointid_t joint, + robot::types::jointid_t joint, @@ -820,7 +833,7 @@

void robot::setMotorPos ( - robot::types::motorid_t motor, + robot::types::motorid_t motor, @@ -851,7 +864,7 @@

void robot::setMotorPower ( - robot::types::motorid_t motor, + robot::types::motorid_t motor, @@ -881,7 +894,7 @@

void robot::setMotorVel ( - robot::types::motorid_t motor, + robot::types::motorid_t motor, @@ -911,7 +924,7 @@

void robot::world_interface_init ( - bool initOnlyMotors = false) + bool initOnlyMotors = false) @@ -933,7 +946,7 @@

- +
constexpr auto robot::encMotorsauto robot::encMotors
@@ -970,7 +983,7 @@

- +
constexpr auto robot::motorPIDMapauto robot::motorPIDMap
@@ -996,7 +1009,7 @@

- +
constexpr auto robot::motorSerialIDMapauto robot::motorSerialIDMap
@@ -1032,7 +1045,7 @@

- +
constexpr auto robot::negative_pwm_scalesauto robot::negative_pwm_scales
@@ -1069,7 +1082,7 @@

- +
constexpr auto robot::pidMotorsauto robot::pidMotors
@@ -1095,7 +1108,7 @@

- +
constexpr auto robot::positive_pwm_scalesauto robot::positive_pwm_scales
@@ -1132,7 +1145,7 @@

- +
constexpr auto robot::potMotorsauto robot::potMotors
@@ -1156,7 +1169,8 @@

+

diff --git a/namespacerobot_1_1types.html b/namespacerobot_1_1types.html index d84a1783..8700a50b 100644 --- a/namespacerobot_1_1types.html +++ b/namespacerobot_1_1types.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): robot::types Namespace Reference + + @@ -39,23 +41,33 @@
- + + +
+
Classes | @@ -97,6 +110,8 @@ + + @@ -228,7 +243,7 @@

Classes

class  bad_datapoint_access
 
class  DataPoint
 Represents data measured using a sensor at a given time. More...
 
- +
constexpr auto robot::types::all_jointid_tauto robot::types::all_jointid_t
@@ -254,7 +269,7 @@

- +
constexpr auto robot::types::name_to_jointidauto robot::types::name_to_jointid
@@ -279,7 +294,8 @@

+

diff --git a/namespaces.html b/namespaces.html index 2bfe04fb..e3165820 100644 --- a/namespaces.html +++ b/namespaces.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Namespace List + + @@ -39,24 +41,35 @@
- + +
+
+
 Cpackettype_tThe types of CAN packets that we recognize  NrobotCollection of functions for manipulating a motor  NtypesTypes for use in the world interface - CDataPointRepresents data measured using a sensor at a given time - CLimitSwitchDataA class that represents limit switches from a specific motor - Cbase_motorAn abstract motor class - Ccan_motor - Cencparams_t - Cpidcoef_tA struct containing a set of PID coefficients - Cpotparams_tRepresents parameters defining a potentiometer scale - Csim_motor - NutilA collection of utility functions and classes with common use-cases - CAsyncTaskAn abstract class that can be overridden to run long-running tasks and encapsulate task-related data - ClatchImplementation of a countdown latch for threading synchronization - CPeriodicSchedulerUses a single thread to periodically invoke callbacks at a given frequency - CPeriodicTaskImplements a task that executes a function periodically - CRAIIHelperA helper class for executing a function when leaving a scope, in RAII-style - CScopedTimerA utility class that helps with timing - CWatchdogImplements a thread-safe watchdog + Cbad_datapoint_access + CDataPointRepresents data measured using a sensor at a given time + CLimitSwitchDataA class that represents limit switches from a specific motor + Cbase_motorAn abstract motor class + Ccan_motor + Cencparams_t + Cpidcoef_tA struct containing a set of PID coefficients + Cpotparams_tRepresents parameters defining a potentiometer scale + Csim_motor + NutilA collection of utility functions and classes with common use-cases + CAsyncTaskAn abstract class that can be overridden to run long-running tasks and encapsulate task-related data + ClatchImplementation of a countdown latch for threading synchronization + CPeriodicSchedulerUses a single thread to periodically invoke callbacks at a given frequency + CPeriodicTaskImplements a task that executes a function periodically + CRAIIHelperA helper class for executing a function when leaving a scope, in RAII-style + CScopedTimerA utility class that helps with timing + CWatchdogImplements a thread-safe watchdog
+ diff --git a/namespaceutil.html b/namespaceutil.html index 1e314d12..b588e2ac 100644 --- a/namespaceutil.html +++ b/namespaceutil.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): util Namespace Reference + + @@ -39,23 +41,33 @@ - + + +
+
diff --git a/navtree.css b/navtree.css new file mode 100644 index 00000000..69211d4a --- /dev/null +++ b/navtree.css @@ -0,0 +1,149 @@ +#nav-tree .children_ul { + margin:0; + padding:4px; +} + +#nav-tree ul { + list-style:none outside none; + margin:0px; + padding:0px; +} + +#nav-tree li { + white-space:nowrap; + margin:0px; + padding:0px; +} + +#nav-tree .plus { + margin:0px; +} + +#nav-tree .selected { + background-image: url('tab_a.png'); + background-repeat:repeat-x; + color: var(--nav-text-active-color); + text-shadow: var(--nav-text-active-shadow); +} + +#nav-tree .selected .arrow { + color: var(--nav-arrow-selected-color); + text-shadow: none; +} + +#nav-tree img { + margin:0px; + padding:0px; + border:0px; + vertical-align: middle; +} + +#nav-tree a { + text-decoration:none; + padding:0px; + margin:0px; +} + +#nav-tree .label { + margin:0px; + padding:0px; + font: 12px var(--font-family-nav); +} + +#nav-tree .label a { + padding:2px; +} + +#nav-tree .selected a { + text-decoration:none; + color:var(--nav-text-active-color); +} + +#nav-tree .children_ul { + margin:0px; + padding:0px; +} + +#nav-tree .item { + margin:0px; + padding:0px; +} + +#nav-tree { + padding: 0px 0px; + font-size:14px; + overflow:auto; +} + +#doc-content { + overflow:auto; + display:block; + padding:0px; + margin:0px; + -webkit-overflow-scrolling : touch; /* iOS 5+ */ +} + +#side-nav { + padding:0 6px 0 0; + margin: 0px; + display:block; + position: absolute; + left: 0px; + width: $width; + overflow : hidden; +} + +.ui-resizable .ui-resizable-handle { + display:block; +} + +.ui-resizable-e { + background-image:var(--nav-splitbar-image); + background-size:100%; + background-repeat:repeat-y; + background-attachment: scroll; + cursor:ew-resize; + height:100%; + right:0; + top:0; + width:6px; +} + +.ui-resizable-handle { + display:none; + font-size:0.1px; + position:absolute; + z-index:1; +} + +#nav-tree-contents { + margin: 6px 0px 0px 0px; +} + +#nav-tree { + background-repeat:repeat-x; + background-color: var(--nav-background-color); + -webkit-overflow-scrolling : touch; /* iOS 5+ */ +} + +#nav-sync { + position:absolute; + top:5px; + right:24px; + z-index:0; +} + +#nav-sync img { + opacity:0.3; +} + +#nav-sync img:hover { + opacity:0.9; +} + +@media print +{ + #nav-tree { display: none; } + div.ui-resizable-handle { display: none; position: relative; } +} + diff --git a/navtypes_8h_source.html b/navtypes_8h_source.html index d4acbc66..08bdfe51 100644 --- a/navtypes_8h_source.html +++ b/navtypes_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/navtypes.h Source File + + @@ -39,18 +41,23 @@
- + + @@ -87,6 +94,7 @@
+
navtypes.h
@@ -146,7 +154,8 @@
+ diff --git a/pages.html b/pages.html index 801c0eb1..0bec6126 100644 --- a/pages.html +++ b/pages.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Related Pages + + @@ -39,24 +41,35 @@ - + + +
+
+
diff --git a/random_8h_source.html b/random_8h_source.html index 04358481..8614419e 100644 --- a/random_8h_source.html +++ b/random_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/utils/random.h Source File + + @@ -39,18 +41,23 @@
- + + @@ -87,6 +94,7 @@ +
random.h
@@ -106,7 +114,8 @@
+ diff --git a/read__landmarks_8h_source.html b/read__landmarks_8h_source.html index a348925e..43fd0b90 100644 --- a/read__landmarks_8h_source.html +++ b/read__landmarks_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/ar/read_landmarks.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
read_landmarks.h
@@ -104,7 +112,8 @@
+ diff --git a/read__usb__gps_8h_source.html b/read__usb__gps_8h_source.html index b1df6634..21275eea 100644 --- a/read__usb__gps_8h_source.html +++ b/read__usb__gps_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/gps/usb_gps/read_usb_gps.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
read_usb_gps.h
@@ -102,7 +110,8 @@
+ diff --git a/real__world__constants_8h_source.html b/real__world__constants_8h_source.html index 3b3cb869..fa537af9 100644 --- a/real__world__constants_8h_source.html +++ b/real__world__constants_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/world_interface/real_world_constants.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
real_world_constants.h
@@ -218,7 +226,7 @@
T & at(int idx, std::vector< T > &items)
::uint16_t uint16_t
::int32_t int32_t
-
motorid_t
The motors on the robot.
Definition data.h:56
+
motorid_t
The motors on the robot.
Definition data.h:57
Collection of functions for manipulating a motor.
Definition ArduPilotInterface.cpp:27
constexpr std::chrono::milliseconds TELEM_PERIOD(50)
The default telemetry period for motors.
constexpr auto pidMotors
The set of motors that are PID controlled.
Definition real_world_constants.h:29
@@ -241,7 +249,8 @@
+ diff --git a/resize.js b/resize.js new file mode 100644 index 00000000..7d8cdc7d --- /dev/null +++ b/resize.js @@ -0,0 +1,145 @@ +/* + @licstart The following is the entire license notice for the JavaScript code in this file. + + The MIT License (MIT) + + Copyright (C) 1997-2020 by Dimitri van Heesch + + Permission is hereby granted, free of charge, to any person obtaining a copy of this software + and associated documentation files (the "Software"), to deal in the Software without restriction, + including without limitation the rights to use, copy, modify, merge, publish, distribute, + sublicense, and/or sell copies of the Software, and to permit persons to whom the Software is + furnished to do so, subject to the following conditions: + + The above copyright notice and this permission notice shall be included in all copies or + substantial portions of the Software. + + THE SOFTWARE IS PROVIDED "AS IS", WITHOUT WARRANTY OF ANY KIND, EXPRESS OR IMPLIED, INCLUDING + BUT NOT LIMITED TO THE WARRANTIES OF MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND + NONINFRINGEMENT. IN NO EVENT SHALL THE AUTHORS OR COPYRIGHT HOLDERS BE LIABLE FOR ANY CLAIM, + DAMAGES OR OTHER LIABILITY, WHETHER IN AN ACTION OF CONTRACT, TORT OR OTHERWISE, ARISING FROM, + OUT OF OR IN CONNECTION WITH THE SOFTWARE OR THE USE OR OTHER DEALINGS IN THE SOFTWARE. + + @licend The above is the entire license notice for the JavaScript code in this file + */ + +function initResizable(treeview) { + let sidenav,navtree,content,header,footer,barWidth=6; + const RESIZE_COOKIE_NAME = ''+'width'; + + function resizeWidth() { + const sidenavWidth = $(sidenav).outerWidth(); + content.css({marginLeft:parseInt(sidenavWidth)+"px"}); + if (typeof page_layout!=='undefined' && page_layout==1) { + footer.css({marginLeft:parseInt(sidenavWidth)+"px"}); + } + Cookie.writeSetting(RESIZE_COOKIE_NAME,sidenavWidth-barWidth); + } + + function restoreWidth(navWidth) { + content.css({marginLeft:parseInt(navWidth)+barWidth+"px"}); + if (typeof page_layout!=='undefined' && page_layout==1) { + footer.css({marginLeft:parseInt(navWidth)+barWidth+"px"}); + } + sidenav.css({width:navWidth + "px"}); + } + + function resizeHeight(treeview) { + const headerHeight = header.outerHeight(); + const windowHeight = $(window).height(); + let contentHeight; + if (treeview) + { + const footerHeight = footer.outerHeight(); + let navtreeHeight,sideNavHeight; + if (typeof page_layout==='undefined' || page_layout==0) { /* DISABLE_INDEX=NO */ + contentHeight = windowHeight - headerHeight - footerHeight; + navtreeHeight = contentHeight; + sideNavHeight = contentHeight; + } else if (page_layout==1) { /* DISABLE_INDEX=YES */ + contentHeight = windowHeight - footerHeight; + navtreeHeight = windowHeight - headerHeight; + sideNavHeight = windowHeight; + } + navtree.css({height:navtreeHeight + "px"}); + sidenav.css({height:sideNavHeight + "px"}); + } + else + { + contentHeight = windowHeight - headerHeight; + } + content.css({height:contentHeight + "px"}); + if (location.hash.slice(1)) { + (document.getElementById(location.hash.slice(1))||document.body).scrollIntoView(); + } + } + + function collapseExpand() { + let newWidth; + if (sidenav.width()>0) { + newWidth=0; + } else { + const width = Cookie.readSetting(RESIZE_COOKIE_NAME,250); + newWidth = (width>250 && width<$(window).width()) ? width : 250; + } + restoreWidth(newWidth); + const sidenavWidth = $(sidenav).outerWidth(); + Cookie.writeSetting(RESIZE_COOKIE_NAME,sidenavWidth-barWidth); + } + + header = $("#top"); + content = $("#doc-content"); + footer = $("#nav-path"); + sidenav = $("#side-nav"); + if (!treeview) { +// title = $("#titlearea"); +// titleH = $(title).height(); +// let animating = false; +// content.on("scroll", function() { +// slideOpts = { duration: 200, +// step: function() { +// contentHeight = $(window).height() - header.outerHeight(); +// content.css({ height : contentHeight + "px" }); +// }, +// done: function() { animating=false; } +// }; +// if (content.scrollTop()>titleH && title.css('display')!='none' && !animating) { +// title.slideUp(slideOpts); +// animating=true; +// } else if (content.scrollTop()<=titleH && title.css('display')=='none' && !animating) { +// title.slideDown(slideOpts); +// animating=true; +// } +// }); + } else { + navtree = $("#nav-tree"); + $(".side-nav-resizable").resizable({resize: function(e, ui) { resizeWidth(); } }); + $(sidenav).resizable({ minWidth: 0 }); + } + $(window).resize(function() { resizeHeight(treeview); }); + if (treeview) + { + const device = navigator.userAgent.toLowerCase(); + const touch_device = device.match(/(iphone|ipod|ipad|android)/); + if (touch_device) { /* wider split bar for touch only devices */ + $(sidenav).css({ paddingRight:'20px' }); + $('.ui-resizable-e').css({ width:'20px' }); + $('#nav-sync').css({ right:'34px' }); + barWidth=20; + } + const width = Cookie.readSetting(RESIZE_COOKIE_NAME,250); + if (width) { restoreWidth(width); } else { resizeWidth(); } + } + resizeHeight(treeview); + const url = location.href; + const i=url.indexOf("#"); + if (i>=0) window.location.hash=url.substr(i); + const _preventDefault = function(evt) { evt.preventDefault(); }; + if (treeview) + { + $("#splitbar").bind("dragstart", _preventDefault).bind("selectstart", _preventDefault); + $(".ui-resizable-handle").dblclick(collapseExpand); + } + $(window).on('load',resizeHeight); +} +/* @license-end */ diff --git a/scheduler_8h_source.html b/scheduler_8h_source.html index 3fc88409..c824b4fb 100644 --- a/scheduler_8h_source.html +++ b/scheduler_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/utils/scheduler.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
scheduler.h
@@ -567,7 +575,8 @@
+ diff --git a/search/all_1.js b/search/all_1.js index 44475130..49e76728 100644 --- a/search/all_1.js +++ b/search/all_1.js @@ -1,7 +1,8 @@ var searchData= [ - ['1_20_3a_20find_20plot_20analyze_0',['1 : Find Plot Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], - ['1_20and_20cmake_20version_203_209_201_1',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], - ['10_2dhld_2doverview_2emd_2',['10-hld-overview.md',['https://docs.opencv.org/4.2.0/d9/d08/10-hld-overview_8md.html',1,'']]], - ['14_201_20and_20cmake_20version_203_209_201_3',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]] + ['1_0',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['1_20_3a_20find_20plot_20analyze_1',['1 : Find Plot Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], + ['1_20and_20cmake_20version_203_209_201_2',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['10_2dhld_2doverview_2emd_3',['10-hld-overview.md',['https://docs.opencv.org/4.2.0/d9/d08/10-hld-overview_8md.html',1,'']]], + ['14_201_20and_20cmake_20version_203_209_201_4',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]] ]; diff --git a/search/all_10.js b/search/all_10.js index f482d950..af887bf5 100644 --- a/search/all_10.js +++ b/search/all_10.js @@ -14,8 +14,8 @@ var searchData= ['g_5ftype_5fof_5ft_11',['g_type_of_t',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a0aaa1cb3a9ff5e9c95ce2ecf680e1a3a',1,'cv::detail']]], ['g_5ftyped_5fkernel_12',['G_TYPED_KERNEL',['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a6e2164c1a75bb5ba96e49272f7eacaf8',1,'cv::gapi::core::G_TYPED_KERNEL(GAdd,< GMat(GMat, GMat, int)>, "org.opencv.core.math.add")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#ac9ea23a0dce0f1d6dbb70908f9669a09',1,'cv::gapi::core::G_TYPED_KERNEL(GAddC,< GMat(GMat, GScalar, int)>, "org.opencv.core.math.addC")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a74927d9d9257c34b5e0fe3f26846e6c0',1,'cv::gapi::core::G_TYPED_KERNEL(GSub,< GMat(GMat, GMat, int)>, "org.opencv.core.math.sub")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a4bb7ca21e2b9c32be04220b2c4b1637c',1,'cv::gapi::core::G_TYPED_KERNEL(GSubC,< GMat(GMat, GScalar, int)>, "org.opencv.core.math.subC")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a10d430f78ac05d9621d3aed60e38812b',1,'cv::gapi::core::G_TYPED_KERNEL(GSubRC,< GMat(GScalar, GMat, int)>, "org.opencv.core.math.subRC")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a29ef59bcc236a623dd46c6a7900cf597',1,'cv::gapi::core::G_TYPED_KERNEL(GMul,< GMat(GMat, GMat, double, int)>, "org.opencv.core.math.mul")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a120334f4221a11de53c2cf0066bfbc72',1,'cv::gapi::core::G_TYPED_KERNEL(GMulCOld,< GMat(GMat, double, int)>, "org.opencv.core.math.mulCOld")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a595f2cb3d3061a93fb14651c830592d1',1,'cv::gapi::core::G_TYPED_KERNEL(GMulC,< GMat(GMat, GScalar, int)>, "org.opencv.core.math.mulC")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#aef5929b591c5e71cf887a8b62313c211',1,'cv::gapi::core::G_TYPED_KERNEL(GMulS,< GMat(GMat, GScalar)>, "org.opencv.core.math.muls")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a010b577a7989b0ac7e1dd846c6d29f89',1,'cv::gapi::core::G_TYPED_KERNEL(GDiv,< GMat(GMat, GMat, double, int)>, "org.opencv.core.math.div")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#ad753d26f1ec0897681091f431fdd204a',1,'cv::gapi::core::G_TYPED_KERNEL(GDivC,< GMat(GMat, GScalar, double, int)>, "org.opencv.core.math.divC")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#aa6918eedfab08deade649213df282449',1,'cv::gapi::core::G_TYPED_KERNEL(GDivRC,< GMat(GScalar, GMat, double, int)>, "org.opencv.core.math.divRC")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a3596b989f6950299156797faaf3f1d0d',1,'cv::gapi::core::G_TYPED_KERNEL(GMean,< GScalar(GMat)>, "org.opencv.core.math.mean")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#aa9831aaad7d2f83ecf742e3657295626',1,'cv::gapi::core::G_TYPED_KERNEL(GPhase,< GMat(GMat, GMat, bool)>, "org.opencv.core.math.phase")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#aa830da48626a059dbc680fbb911d9c00',1,'cv::gapi::core::G_TYPED_KERNEL(GMask,< GMat(GMat, GMat)>, "org.opencv.core.pixelwise.mask")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a327390d0946f72deccb654c4d2ab52e0',1,'cv::gapi::core::G_TYPED_KERNEL(GCmpGT,< GMat(GMat, GMat)>, "org.opencv.core.pixelwise.compare.cmpGT")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#ac1a9a537b0febdeafcf0c39a36607a4a',1,'cv::gapi::core::G_TYPED_KERNEL(GCmpGE,< GMat(GMat, GMat)>, "org.opencv.core.pixelwise.compare.cmpGE")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a5d9f1e27c821dc7f7ec13890ecb15f3b',1,'cv::gapi::core::G_TYPED_KERNEL(GCmpLE,< GMat(GMat, GMat)>, "org.opencv.core.pixelwise.compare.cmpLE")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#aedf1d0fa02fa278fbe84f652ec92cb29',1,'cv::gapi::core::G_TYPED_KERNEL(GCmpLT,< GMat(GMat, GMat)>, "org.opencv.core.pixelwise.compare.cmpLT")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a6018fa2bb652393666e824a9d78e6799',1,'cv::gapi::core::G_TYPED_KERNEL(GCmpEQ,< GMat(GMat, GMat)>, "org.opencv.core.pixelwise.compare.cmpEQ")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a052ca7a7a252afbd2c8bd26c150d5ce1',1,'cv::gapi::core::G_TYPED_KERNEL(GCmpNE,< GMat(GMat, GMat)>, "org.opencv.core.pixelwise.compare.cmpNE")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#af72ecd62436658317832890369b92b83',1,'cv::gapi::core::G_TYPED_KERNEL(GCmpGTScalar,< GMat(GMat, GScalar)>, "org.opencv.core.pixelwise.compare.cmpGTScalar")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a2061c1d063cc7409dcf0fdf92556884b',1,'cv::gapi::core::G_TYPED_KERNEL(GCmpGEScalar,< GMat(GMat, GScalar)>, "org.opencv.core.pixelwise.compare.cmpGEScalar")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a0b67332ae52dd2037a435114c74266ec',1,'cv::gapi::core::G_TYPED_KERNEL(GCmpLEScalar,< GMat(GMat, GScalar)>, "org.opencv.core.pixelwise.compare.cmpLEScalar")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#ad04b1183456619ff0469a1013dfee4d3',1,'cv::gapi::core::G_TYPED_KERNEL(GCmpLTScalar,< GMat(GMat, GScalar)>, "org.opencv.core.pixelwise.compare.cmpLTScalar")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a90b04a2c3c003f4f1db2ca1fea86b564',1,'cv::gapi::core::G_TYPED_KERNEL(GCmpEQScalar,< GMat(GMat, GScalar)>, "org.opencv.core.pixelwise.compare.cmpEQScalar")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a7258359294055d336dcfa72fe5cd2e56',1,'cv::gapi::core::G_TYPED_KERNEL(GCmpNEScalar,< GMat(GMat, GScalar)>, "org.opencv.core.pixelwise.compare.cmpNEScalar")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a4da41e712d6cff45258bcbfd68500bda',1,'cv::gapi::core::G_TYPED_KERNEL(GAnd,< GMat(GMat, GMat)>, "org.opencv.core.pixelwise.bitwise_and")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a1cff21d5caa3603ebda0304f09e1f59b',1,'cv::gapi::core::G_TYPED_KERNEL(GAndS,< GMat(GMat, GScalar)>, "org.opencv.core.pixelwise.bitwise_andS")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#aff5dc0a46e3ebe84e60ac0372457f2f0',1,'cv::gapi::core::G_TYPED_KERNEL(GOr,< GMat(GMat, GMat)>, "org.opencv.core.pixelwise.bitwise_or")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a5e3bb8b6fd8ef8c7dff464c7fecd6724',1,'cv::gapi::core::G_TYPED_KERNEL(GOrS,< GMat(GMat, GScalar)>, "org.opencv.core.pixelwise.bitwise_orS")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a7a69e0b2f6277edce847e76bc4f31268',1,'cv::gapi::core::G_TYPED_KERNEL(GXor,< GMat(GMat, GMat)>, "org.opencv.core.pixelwise.bitwise_xor")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#acd7d3948fade5de959df9001e3cbb2c7',1,'cv::gapi::core::G_TYPED_KERNEL(GXorS,< GMat(GMat, GScalar)>, "org.opencv.core.pixelwise.bitwise_xorS")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a1a4446ef260dcc850080a32e7c0ebce4',1,'cv::gapi::core::G_TYPED_KERNEL(GNot,< GMat(GMat)>, "org.opencv.core.pixelwise.bitwise_not")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a15cc4f0579b195436ee13b692be9d45f',1,'cv::gapi::core::G_TYPED_KERNEL(GSelect,< GMat(GMat, GMat, GMat)>, "org.opencv.core.pixelwise.select")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a9ec08fed4ec4d0bac322974e2fa65fa1',1,'cv::gapi::core::G_TYPED_KERNEL(GMin,< GMat(GMat, GMat)>, "org.opencv.core.matrixop.min")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a08aec321c243197363ddc856558d3567',1,'cv::gapi::core::G_TYPED_KERNEL(GMax,< GMat(GMat, GMat)>, "org.opencv.core.matrixop.max")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a1d20c8b46df56c48f1f4db0cc43c93c2',1,'cv::gapi::core::G_TYPED_KERNEL(GAbsDiff,< GMat(GMat, GMat)>, "org.opencv.core.matrixop.absdiff")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#acc2ee85bb17f2e8370f719d0d79e3fdd',1,'cv::gapi::core::G_TYPED_KERNEL(GAbsDiffC,< GMat(GMat, GScalar)>, "org.opencv.core.matrixop.absdiffC")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a827262fbb9d53cfa6f205e1b5bd2fada',1,'cv::gapi::core::G_TYPED_KERNEL(GSum,< GScalar(GMat)>, "org.opencv.core.matrixop.sum")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#ac178655f862b125197d0aff4621b53c3',1,'cv::gapi::core::G_TYPED_KERNEL(GAddW,< GMat(GMat, double, GMat, double, double, int)>, "org.opencv.core.matrixop.addweighted")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a70163400cfea11587861508b31191560',1,'cv::gapi::core::G_TYPED_KERNEL(GNormL1,< GScalar(GMat)>, "org.opencv.core.matrixop.norml1")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#accdb022a8bd58144959fe3b1914437cf',1,'cv::gapi::core::G_TYPED_KERNEL(GNormL2,< GScalar(GMat)>, "org.opencv.core.matrixop.norml2")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a0c9e74a71342a22b7a28bde1dd6d062d',1,'cv::gapi::core::G_TYPED_KERNEL(GNormInf,< GScalar(GMat)>, "org.opencv.core.matrixop.norminf")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a8f2b46f1c8a849c23f1677e8a60074dd',1,'cv::gapi::core::G_TYPED_KERNEL(GThreshold,< GMat(GMat, GScalar, GScalar, int)>, "org.opencv.core.matrixop.threshold")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a18ad9ead6c6af17ac3cfa43b3ab39ab5',1,'cv::gapi::core::G_TYPED_KERNEL(GInRange,< GMat(GMat, GScalar, GScalar)>, "org.opencv.core.matrixop.inrange")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a766ceb64bfc5bfbecf3ae643b525aee4',1,'cv::gapi::core::G_TYPED_KERNEL(GResize,< GMat(GMat, Size, double, double, int)>, "org.opencv.core.transform.resize")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a83b181f9b64db881e6c4a4078b1e6445',1,'cv::gapi::core::G_TYPED_KERNEL(GResizeP,< GMatP(GMatP, Size, int)>, "org.opencv.core.transform.resizeP")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a1edd0e350a65b08f0fa1415da0cd43ab',1,'cv::gapi::core::G_TYPED_KERNEL(GMerge3,< GMat(GMat, GMat, GMat)>, "org.opencv.core.transform.merge3")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a05585336a90529347c12d89f999c826c',1,'cv::gapi::core::G_TYPED_KERNEL(GMerge4,< GMat(GMat, GMat, GMat, GMat)>, "org.opencv.core.transform.merge4")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a0fc6edcb889dab3283b84d489d7d90d4',1,'cv::gapi::core::G_TYPED_KERNEL(GRemap,< GMat(GMat, Mat, Mat, int, int, Scalar)>, "org.opencv.core.transform.remap")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a53316f7d604ffd1a99a134e064d6b03d',1,'cv::gapi::core::G_TYPED_KERNEL(GFlip,< GMat(GMat, int)>, "org.opencv.core.transform.flip")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a8a383cbe54ad210c8026f5723e2a714e',1,'cv::gapi::core::G_TYPED_KERNEL(GCrop,< GMat(GMat, Rect)>, "org.opencv.core.transform.crop")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a95a2bdb13fd215bb5bd185d617e3f9c5',1,'cv::gapi::core::G_TYPED_KERNEL(GCopy,< GMat(GMat)>, "org.opencv.core.transform.copy")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a443947eee697dbd3ccfcd10f47795931',1,'cv::gapi::core::G_TYPED_KERNEL(GConcatHor,< GMat(GMat, GMat)>, "org.opencv.imgproc.transform.concatHor")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a5681c6b843c25051be0166e383fa895c',1,'cv::gapi::core::G_TYPED_KERNEL(GConcatVert,< GMat(GMat, GMat)>, "org.opencv.imgproc.transform.concatVert")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a2b66d20743bd169abc1a7139fddef697',1,'cv::gapi::core::G_TYPED_KERNEL(GLUT,< GMat(GMat, Mat)>, "org.opencv.core.transform.LUT")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a1f55e4845f4811ad6bc788451df93951',1,'cv::gapi::core::G_TYPED_KERNEL(GConvertTo,< GMat(GMat, int, double, double)>, "org.opencv.core.transform.convertTo")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#ad208f51242a5edcd8977dec095506218',1,'cv::gapi::core::G_TYPED_KERNEL(GSqrt,< GMat(GMat)>, "org.opencv.core.math.sqrt")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a6c0b23a7574fe8f652c0f77d3f9b52f8',1,'cv::gapi::core::G_TYPED_KERNEL(GNormalize,< GMat(GMat, double, double, int, int)>, "org.opencv.core.normalize")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#ab57af3310ccbfe911a61ac15deea5b3f',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GFilter2D,< GMat(GMat, int, Mat, Point, Scalar, int, Scalar)>,"org.opencv.imgproc.filters.filter2D")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#ade73cf034cc0e180ef668443f9a29100',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GSepFilter,< GMat(GMat, int, Mat, Mat, Point, Scalar, int, Scalar)>, "org.opencv.imgproc.filters.sepfilter")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a717b6278a9ff403e022876ee0e8f1c95',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GBoxFilter,< GMat(GMat, int, Size, Point, bool, int, Scalar)>, "org.opencv.imgproc.filters.boxfilter")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a1cd418ffad832a3f5e465bc6fc04c787',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GBlur,< GMat(GMat, Size, Point, int, Scalar)>, "org.opencv.imgproc.filters.blur")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#ad068417b91ec315ed8822698ea7f420b',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GGaussBlur,< GMat(GMat, Size, double, double, int, Scalar)>, "org.opencv.imgproc.filters.gaussianBlur")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a5ab4754ae4780a80cd20a507a0e9a585',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GMedianBlur,< GMat(GMat, int)>, "org.opencv.imgproc.filters.medianBlur")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a91b030c4870ed242785018acc657b268',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GErode,< GMat(GMat, Mat, Point, int, int, Scalar)>, "org.opencv.imgproc.filters.erode")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a7f53b7747605d66a91dd86f80a0425d4',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GDilate,< GMat(GMat, Mat, Point, int, int, Scalar)>, "org.opencv.imgproc.filters.dilate")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#af8a1e856292df3f3e82e2871b8000fc9',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GSobel,< GMat(GMat, int, int, int, int, double, double, int, Scalar)>, "org.opencv.imgproc.filters.sobel")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a74f190965d19db0416a571e4cb452e37',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GEqHist,< GMat(GMat)>, "org.opencv.imgproc.equalizeHist")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#ae4d08791e41b79d0cc4b935a49f1e496',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GCanny,< GMat(GMat, double, double, int, bool)>, "org.opencv.imgproc.canny")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#aba165d805a3ed1ddfef27bd48aa9b793',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GRGB2YUV,< GMat(GMat)>, "org.opencv.imgproc.colorconvert.rgb2yuv")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#acfe98a43caa59a6175184672020925d2',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GYUV2RGB,< GMat(GMat)>, "org.opencv.imgproc.colorconvert.yuv2rgb")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#aeaeaba861d8831272f6dffd32078a223',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GNV12toRGB,< GMat(GMat, GMat)>, "org.opencv.imgproc.colorconvert.nv12torgb")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#aabc05fef579914a6717062d62a3f3da9',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GNV12toBGR,< GMat(GMat, GMat)>, "org.opencv.imgproc.colorconvert.nv12tobgr")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a87cc1fb1050a8519486ef611d7de023e',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GRGB2Lab,< GMat(GMat)>, "org.opencv.imgproc.colorconvert.rgb2lab")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#aeb437878c83b0f783bbb1216a6911dce',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GBGR2LUV,< GMat(GMat)>, "org.opencv.imgproc.colorconvert.bgr2luv")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a3ea3ca3cbf7786fc2a5866ae6421653e',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GLUV2BGR,< GMat(GMat)>, "org.opencv.imgproc.colorconvert.luv2bgr")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#aaf8f8e07f52cf14c9a06d27b2fff45df',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GYUV2BGR,< GMat(GMat)>, "org.opencv.imgproc.colorconvert.yuv2bgr")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a4770be1c8483d01ee6dfa32ebc17b2b6',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GBGR2YUV,< GMat(GMat)>, "org.opencv.imgproc.colorconvert.bgr2yuv")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a5e4ef69aa5d87f8c9154918c55b177bd',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GRGB2Gray,< GMat(GMat)>, "org.opencv.imgproc.colorconvert.rgb2gray")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a700d532d43e0800601b4f3432c641abc',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GRGB2GrayCustom,< GMat(GMat, float, float, float)>, "org.opencv.imgproc.colorconvert.rgb2graycustom")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a2c02b0e546abbfadcadc7e1326ad7063',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GBGR2Gray,< GMat(GMat)>, "org.opencv.imgproc.colorconvert.bgr2gray")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a6516544faf97eb6b93322f9b71db3794',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GBayerGR2RGB,< cv::GMat(cv::GMat)>, "org.opencv.imgproc.colorconvert.bayergr2rgb")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a70ef78cf5bf28b57b55a107d30cc1cb0',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GRGB2HSV,< cv::GMat(cv::GMat)>, "org.opencv.imgproc.colorconvert.rgb2hsv")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a3f184a76457688a37f65be6fd15a5148',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GRGB2YUV422,< cv::GMat(cv::GMat)>, "org.opencv.imgproc.colorconvert.rgb2yuv422")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#affd765bc5d6a7b625671fc96785dd75a',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GNV12toRGBp,< GMatP(GMat, GMat)>, "org.opencv.colorconvert.imgproc.nv12torgbp")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a6cccb3aa6957c979b3c4663d32df1c8c',1,'cv::gapi::imgproc::G_TYPED_KERNEL(GNV12toBGRp,< GMatP(GMat, GMat)>, "org.opencv.colorconvert.imgproc.nv12tobgrp")']]], ['g_5ftyped_5fkernel_5fm_13',['G_TYPED_KERNEL_M',['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a1e338a0f2befffbd65959190886b62c4',1,'cv::gapi::core::G_TYPED_KERNEL_M(GPolarToCart,< GMat2(GMat, GMat, bool)>, "org.opencv.core.math.polarToCart")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#adfecadedbbe1a625f6b58811e095f9d5',1,'cv::gapi::core::G_TYPED_KERNEL_M(GCartToPolar,< GMat2(GMat, GMat, bool)>, "org.opencv.core.math.cartToPolar")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#afc961da7c484e7555149cc9c78fa2ec3',1,'cv::gapi::core::G_TYPED_KERNEL_M(GIntegral,< GMat2(GMat, int, int)>, "org.opencv.core.matrixop.integral")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a0015fc2a7cca83e46d759e0d6a294706',1,'cv::gapi::core::G_TYPED_KERNEL_M(GThresholdOT,< GMatScalar(GMat, GScalar, int)>, "org.opencv.core.matrixop.thresholdOT")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#a1c239b61dec5479c0da1c3e5d4977f01',1,'cv::gapi::core::G_TYPED_KERNEL_M(GSplit3,< GMat3(GMat)>, "org.opencv.core.transform.split3")'],['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html#aeef944a45e94e088f7575118a54c989e',1,'cv::gapi::core::G_TYPED_KERNEL_M(GSplit4,< GMat4(GMat)>,"org.opencv.core.transform.split4")'],['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html#a3d210c745929a542266552327732a7e9',1,'cv::gapi::imgproc::G_TYPED_KERNEL_M()']]], - ['gain_14',['gain',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a077d73eb075b00779dc009a9057c27c3',1,'cv::KalmanFilter']]], - ['gain_15',['GAIN',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baa6ba7b5295c631d353f070e1e471d8cee',1,'cv::detail::ExposureCompensator']]], + ['gain_14',['GAIN',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baa6ba7b5295c631d353f070e1e471d8cee',1,'cv::detail::ExposureCompensator']]], + ['gain_15',['gain',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a077d73eb075b00779dc009a9057c27c3',1,'cv::KalmanFilter']]], ['gain_5fblocks_16',['GAIN_BLOCKS',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baac165e2abfe45df8b7216509597a833e8',1,'cv::detail::ExposureCompensator']]], ['gaincompensator_17',['GainCompensator',['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html',1,'cv::detail::GainCompensator'],['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#a3dc6bb6e656a6c06c63fe9fc068be65d',1,'cv::detail::GainCompensator::GainCompensator()'],['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#a4b57be6c7d4a7e5871efc6b8c6ab6948',1,'cv::detail::GainCompensator::GainCompensator(int nr_feeds)']]], ['gains_18',['gains',['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html#a4b72c08cf5350c4ad0c2346b73a7b233',1,'cv::detail::ChannelsCompensator::gains()'],['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#a015776f71f29ebc8f90fc4b5bbe8286e',1,'cv::detail::GainCompensator::gains()']]], @@ -41,10 +41,10 @@ var searchData= ['gather_38',['gather',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a1b5d6a81bfbf9135c75babed35ad68ff',1,'cv::TLSDataAccumulator::gather()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a1b5d6a81bfbf9135c75babed35ad68ff',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::gather()']]], ['gatherdata_39',['gatherData',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#a4a994d1b68e3b63526b7f131f193af4f',1,'cv::TLSDataContainer']]], ['gausian_5fmedian_5fblur_5fbilateral_5ffilter_2emarkdown_40',['gausian_median_blur_bilateral_filter.markdown',['https://docs.opencv.org/4.2.0/d1/d3d/gausian__median__blur__bilateral__filter_8markdown.html',1,'']]], - ['gaussian_41',['gaussian',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a8df8ce4dc7d15916cee743e5a884639d',1,'cv::RNG']]], - ['gaussian_42',['GAUSSIAN',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ade71470ec8814021728f8b31b09773b0ae3d886f16c8018eebf26d8d75a90dd7e',1,'cv::ml::ANN_MLP::GAUSSIAN'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#ac72268153bf12925f601c4defe7d5e50a90fc80ce009b279cde69707d90988268',1,'cv::xfeatures2d::PCTSignatures::GAUSSIAN']]], - ['gaussianblur_43',['gaussianBlur',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaaca00b81d171421032917e53751ac427',1,'cv::gapi::gaussianBlur()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaaca00b81d171421032917e53751ac427',1,'gaussianBlur()(Global Namespace)']]], - ['gaussianblur_44',['GaussianBlur',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaabe8c836e97159a9193fb0b11ac52cf1',1,'cv::GaussianBlur()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaabe8c836e97159a9193fb0b11ac52cf1',1,'GaussianBlur()(Global Namespace)']]], + ['gaussian_41',['GAUSSIAN',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ade71470ec8814021728f8b31b09773b0ae3d886f16c8018eebf26d8d75a90dd7e',1,'cv::ml::ANN_MLP::GAUSSIAN'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#ac72268153bf12925f601c4defe7d5e50a90fc80ce009b279cde69707d90988268',1,'cv::xfeatures2d::PCTSignatures::GAUSSIAN']]], + ['gaussian_42',['gaussian',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a8df8ce4dc7d15916cee743e5a884639d',1,'cv::RNG']]], + ['gaussianblur_43',['GaussianBlur',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaabe8c836e97159a9193fb0b11ac52cf1',1,'cv::GaussianBlur()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaabe8c836e97159a9193fb0b11ac52cf1',1,'GaussianBlur()(Global Namespace)']]], + ['gaussianblur_44',['gaussianBlur',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaaca00b81d171421032917e53751ac427',1,'cv::gapi::gaussianBlur()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaaca00b81d171421032917e53751ac427',1,'gaussianBlur()(Global Namespace)']]], ['gaussianmotionfilter_45',['GaussianMotionFilter',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1videostab_1_1GaussianMotionFilter.html',1,'cv::videostab::GaussianMotionFilter'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#gab213d5ccfc50909eace156ca0102c162',1,'cv::videostab::GaussianMotionFilter::GaussianMotionFilter()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#gab213d5ccfc50909eace156ca0102c162',1,'GaussianMotionFilter()(Global Namespace)']]], ['gbackend_46',['GBackend',['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html',1,'cv::gapi::GBackend'],['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html#a6e032dfa3f2273017aa6a93fbb56a2c5',1,'cv::gapi::GBackend::GBackend()'],['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html#a5adf4621dcbaf0d8ac438f1c160ce258',1,'cv::gapi::GBackend::GBackend(std::shared_ptr< Priv > &&p)']]], ['gbump_47',['gbump',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'__gnu_cxx::enc_filebuf::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'__gnu_cxx::stdio_filebuf::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'__gnu_cxx::stdio_sync_filebuf::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'basic_filebuf< char_type, traits_type >::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'basic_streambuf< _Elem, _Tr >::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'basic_streambuf< char, _Traits >::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'basic_streambuf< char, char_traits< char > >::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'std::basic_filebuf::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'std::basic_streambuf::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'std::basic_stringbuf::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'std::wbuffer_convert::gbump()']]], @@ -1124,8 +1124,8 @@ var searchData= ['gimpl_3a_3agcpuexecutable_1121',['GCPUExecutable',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#a3e74517abadc588f262b9d71222c8fd0',1,'cv::GCPUContext']]], ['gimpl_3a_3agoclexecutable_1122',['GOCLExecutable',['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a1c0bdef3cddbcf4d7a1c64e48248732c',1,'cv::GOCLContext']]], ['gimpl_3a_3arender_3a_3aocv_3a_3agrenderexecutable_1123',['GRenderExecutable',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#ada601e62f329b5c61a441094166ff0b7',1,'cv::GCPUContext']]], - ['gin_1124',['gin',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a4941eb8cbe70b8c7187bc8459af7653b',1,'cv']]], - ['gin_1125',['GIn',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a8e40d34081b18c79ba4c3cfb9fd0634f',1,'cv']]], + ['gin_1124',['GIn',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a8e40d34081b18c79ba4c3cfb9fd0634f',1,'cv']]], + ['gin_1125',['gin',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a4941eb8cbe70b8c7187bc8459af7653b',1,'cv']]], ['ginfer_1126',['GInfer',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1GInfer.html',1,'cv']]], ['ginferbase_1127',['GInferBase',['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1GInferBase.html',1,'cv']]], ['ginferlist_1128',['GInferList',['https://docs.opencv.org/4.2.0/d3/dc3/structcv_1_1GInferList.html',1,'cv']]], @@ -1286,8 +1286,8 @@ var searchData= ['graphcutseamfinderbase_1283',['GraphCutSeamFinderBase',['https://docs.opencv.org/4.2.0/d0/d03/classcv_1_1detail_1_1GraphCutSeamFinderBase.html',1,'cv::detail']]], ['graphedge_1284',['GraphEdge',['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html',1,'cv::detail::GraphEdge'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga7de758260f93bd840c47184aef9b25a2',1,'cv::detail::GraphEdge::GraphEdge()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga7de758260f93bd840c47184aef9b25a2',1,'GraphEdge()(Global Namespace)']]], ['graphsegmentation_1285',['GraphSegmentation',['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1ximgproc_1_1segmentation_1_1GraphSegmentation.html',1,'cv::ximgproc::segmentation']]], - ['gray_1286',['gray',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a2c1274180ee9177035d082123c5942d7',1,'cv::viz::Color']]], - ['gray_1287',['GRAY',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#a2a97c5b832651524b8e782496b933d45af4b7ee26bf522d5990232296a3f0c18e',1,'cv::TrackerKCF']]], + ['gray_1286',['GRAY',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#a2a97c5b832651524b8e782496b933d45af4b7ee26bf522d5990232296a3f0c18e',1,'cv::TrackerKCF']]], + ['gray_1287',['gray',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a2c1274180ee9177035d082123c5942d7',1,'cv::viz::Color']]], ['gray_20code_20pattern_20tutorial_1288',['Gray code pattern tutorial',['https://docs.opencv.org/4.2.0/db/d56/tutorial_capture_graycode_pattern.html',1,'Capture Gray code pattern tutorial'],['https://docs.opencv.org/4.2.0/dc/da9/tutorial_decode_graycode_pattern.html',1,'Decode Gray code pattern tutorial']]], ['gray2rgb_1289',['Gray2RGB',['https://docs.opencv.org/4.2.0/df/d47/classcv_1_1cudev_1_1color__cvt__detail_1_1Gray2RGB.html',1,'cv::cudev::color_cvt_detail']]], ['gray_5fto_5fbgr555_5ffunc_1290',['GRAY_to_BGR555_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4407e64567bab23e3c4085646858b53',1,'cv::cudev::GRAY_to_BGR555_func'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4407e64567bab23e3c4085646858b53',1,'GRAY_to_BGR555_func(Global Namespace)']]], @@ -1345,8 +1345,8 @@ var searchData= ['gridtransformunary_5f_1342',['gridTransformUnary_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7305d935fe896131a72ab9dc5aea553',1,'cv::cudev::gridTransformUnary_(const SrcPtr &src, GpuMat_< DstType > &dst, const UnOp &op, const MaskPtr &mask, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74255dcefdcfc7f4275b786b43ddff1a',1,'cv::cudev::gridTransformUnary_(const SrcPtr &src, const GlobPtrSz< DstType > &dst, const UnOp &op, const MaskPtr &mask, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacf62a779cee17af91ddb7b422def3d8',1,'cv::cudev::gridTransformUnary_(const SrcPtr &src, GpuMat_< DstType > &dst, const UnOp &op, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1673a19876d5a8687b6f7b4f963f222',1,'cv::cudev::gridTransformUnary_(const SrcPtr &src, const GlobPtrSz< DstType > &dst, const UnOp &op, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7305d935fe896131a72ab9dc5aea553',1,'gridTransformUnary_(const SrcPtr &src, GpuMat_< DstType > &dst, const UnOp &op, const MaskPtr &mask, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74255dcefdcfc7f4275b786b43ddff1a',1,'gridTransformUnary_(const SrcPtr &src, const GlobPtrSz< DstType > &dst, const UnOp &op, const MaskPtr &mask, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacf62a779cee17af91ddb7b422def3d8',1,'gridTransformUnary_(const SrcPtr &src, GpuMat_< DstType > &dst, const UnOp &op, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1673a19876d5a8687b6f7b4f963f222',1,'gridTransformUnary_(const SrcPtr &src, const GlobPtrSz< DstType > &dst, const UnOp &op, Stream &stream=Stream::Null())(Global Namespace)']]], ['gridtranspose_1343',['gridTranspose',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd63b476bd2b5a52cef49e1dabd2ad2a',1,'cv::cudev::gridTranspose(const SrcPtr &src, GpuMat_< DstType > &dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga290fb3e930ebc8308812d08f819a51e0',1,'cv::cudev::gridTranspose(const SrcPtr &src, const GlobPtrSz< DstType > &dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd63b476bd2b5a52cef49e1dabd2ad2a',1,'gridTranspose(const SrcPtr &src, GpuMat_< DstType > &dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga290fb3e930ebc8308812d08f819a51e0',1,'gridTranspose(const SrcPtr &src, const GlobPtrSz< DstType > &dst, Stream &stream=Stream::Null())(Global Namespace)']]], ['gridtranspose_5f_1344',['gridTranspose_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad837ad7ef1b987a007cbf30593c77e89',1,'cv::cudev::gridTranspose_(const SrcPtr &src, GpuMat_< DstType > &dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c637b0e6e380393330f6617c6657c81',1,'cv::cudev::gridTranspose_(const SrcPtr &src, const GlobPtrSz< DstType > &dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad837ad7ef1b987a007cbf30593c77e89',1,'gridTranspose_(const SrcPtr &src, GpuMat_< DstType > &dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c637b0e6e380393330f6617c6657c81',1,'gridTranspose_(const SrcPtr &src, const GlobPtrSz< DstType > &dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['gridtype_1345',['gridType',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a82af3743c4059919d2af3937ab222073',1,'cv::CirclesGridFinderParameters']]], - ['gridtype_1346',['GridType',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#ad83bbd88c4d01f670638e8ef4ffa6240',1,'cv::CirclesGridFinderParameters']]], + ['gridtype_1345',['GridType',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#ad83bbd88c4d01f670638e8ef4ffa6240',1,'cv::CirclesGridFinderParameters']]], + ['gridtype_1346',['gridType',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a82af3743c4059919d2af3937ab222073',1,'cv::CirclesGridFinderParameters']]], ['ground_5ftruth_2eh_1347',['ground_truth.h',['https://docs.opencv.org/4.2.0/dd/d54/ground__truth_8h.html',1,'']]], ['groundtruth_1348',['groundTruth',['https://docs.opencv.org/4.2.0/d7/dce/structcv_1_1datasets_1_1groundTruth.html',1,'cv::datasets']]], ['groundtruths_1349',['groundTruths',['https://docs.opencv.org/4.2.0/d3/dad/structcv_1_1datasets_1_1GR__chalearnObj.html#a43d3cb2e0a81d118d1ba12329e243069',1,'cv::datasets::GR_chalearnObj']]], @@ -1403,12 +1403,11 @@ var searchData= ['gui_20features_1400',['GUI Features',['https://docs.opencv.org/4.2.0/df/d04/tutorial_js_table_of_contents_gui.html',1,'']]], ['gui_20features_20in_20opencv_1401',['Gui Features in OpenCV',['https://docs.opencv.org/4.2.0/dc/d4d/tutorial_py_table_of_contents_gui.html',1,'']]], ['gui_20for_20interactive_20visual_20debugging_20of_20computer_20vision_20programs_1402',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], - ['guide_1403',['Quick reference guide',['https://eigen.tuxfamily.org/dox/group__QuickRefPage.html',1,'']]], - ['guide_1404',['Style Guide',['../md_StyleGuide.html',1,'']]], - ['guide_1405',['Transition guide',['https://docs.opencv.org/4.2.0/db/dfa/tutorial_transition_guide.html',1,'']]], - ['guide_20for_20sparse_20matrices_1406',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], - ['guided_5ffilter_1407',['GUIDED_FILTER',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50bac17af01b156904658f6b8307a64422f2',1,'cv::ximgproc::GUIDED_FILTER'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50bac17af01b156904658f6b8307a64422f2',1,'GUIDED_FILTER(Global Namespace)']]], - ['guidedfilter_1408',['GuidedFilter',['https://docs.opencv.org/4.2.0/de/d73/classcv_1_1ximgproc_1_1GuidedFilter.html',1,'cv::ximgproc']]], - ['guidedfilter_1409',['guidedFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga86813d59f8452a9600e979c6287805f5',1,'cv::ximgproc::guidedFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga86813d59f8452a9600e979c6287805f5',1,'guidedFilter()(Global Namespace)']]], - ['gw_1410',['GW',['https://docs.opencv.org/4.2.0/d0/dc4/classcv_1_1GFluidKernel.html#a4e11dfec24f2271e6c075bebb482b634',1,'cv::GFluidKernel']]] + ['guide_1403',['Style Guide',['../md_StyleGuide.html',1,'']]], + ['guide_1404',['guide',['https://eigen.tuxfamily.org/dox/group__QuickRefPage.html',1,'Quick reference guide'],['https://docs.opencv.org/4.2.0/db/dfa/tutorial_transition_guide.html',1,'Transition guide']]], + ['guide_20for_20sparse_20matrices_1405',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], + ['guided_5ffilter_1406',['GUIDED_FILTER',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50bac17af01b156904658f6b8307a64422f2',1,'cv::ximgproc::GUIDED_FILTER'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50bac17af01b156904658f6b8307a64422f2',1,'GUIDED_FILTER(Global Namespace)']]], + ['guidedfilter_1407',['GuidedFilter',['https://docs.opencv.org/4.2.0/de/d73/classcv_1_1ximgproc_1_1GuidedFilter.html',1,'cv::ximgproc']]], + ['guidedfilter_1408',['guidedFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga86813d59f8452a9600e979c6287805f5',1,'cv::ximgproc::guidedFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga86813d59f8452a9600e979c6287805f5',1,'guidedFilter()(Global Namespace)']]], + ['gw_1409',['GW',['https://docs.opencv.org/4.2.0/d0/dc4/classcv_1_1GFluidKernel.html#a4e11dfec24f2271e6c075bebb482b634',1,'cv::GFluidKernel']]] ]; diff --git a/search/all_11.js b/search/all_11.js index d83b132e..1aebf125 100644 --- a/search/all_11.js +++ b/search/all_11.js @@ -351,9 +351,9 @@ var searchData= ['hdf5_2ehpp_348',['hdf5.hpp',['https://docs.opencv.org/4.2.0/de/d24/hdf5_8hpp.html',1,'']]], ['hdo_5fdeskew_349',['HDO_DESKEW',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a63f608e1fc7cbef07a95509fcf4881d2a57f7f7fc62201b48417cbf5a2b7ab2b8',1,'cv::ximgproc']]], ['hdo_5fraw_350',['HDO_RAW',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a63f608e1fc7cbef07a95509fcf4881d2a26943a034c064fd5f4d37683a9e82062',1,'cv::ximgproc']]], - ['hdr_351',['Hdr',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html',1,'cv::SparseMat::Hdr'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#af7347f393f1c5c497d05ec6a7fa98e38',1,'cv::SparseMat::Hdr::Hdr()']]], - ['hdr_352',['hdr',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a3741ff43acd46b31aace23dee092d85a',1,'cv::SparseMat']]], - ['hdr_353',['High Dynamic Range (HDR)',['https://docs.opencv.org/4.2.0/d2/df0/tutorial_py_hdr.html',1,'']]], + ['hdr_351',['High Dynamic Range (HDR)',['https://docs.opencv.org/4.2.0/d2/df0/tutorial_py_hdr.html',1,'']]], + ['hdr_352',['Hdr',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html',1,'cv::SparseMat::Hdr'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#af7347f393f1c5c497d05ec6a7fa98e38',1,'cv::SparseMat::Hdr::Hdr()']]], + ['hdr_353',['hdr',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a3741ff43acd46b31aace23dee092d85a',1,'cv::SparseMat']]], ['hdr_20imaging_354',['HDR imaging',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html',1,'']]], ['hdr_5fimaging_2emarkdown_355',['hdr_imaging.markdown',['https://docs.opencv.org/4.2.0/d9/d87/hdr__imaging_8markdown.html',1,'']]], ['headerisnull_356',['HeaderIsNull',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa1349d0a8af3047dfd9d32f62cfcadae8',1,'cv::Error']]], @@ -415,227 +415,228 @@ var searchData= ['histogram_412',['Creating a 3D histogram',['https://docs.opencv.org/4.2.0/d1/d1d/tutorial_histo3D.html',1,'']]], ['histogram_203_20_3a_20histogram_20backprojection_413',['Histogram - 3 : Histogram Backprojection',['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_histogram_backprojection.html',1,'']]], ['histogram_204_20_3a_20histogram_20backprojection_414',['Histogram - 4 : Histogram Backprojection',['https://docs.opencv.org/4.2.0/dc/df6/tutorial_py_histogram_backprojection.html',1,'']]], - ['histogram_20calculation_415',['Histogram Calculation',['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html',1,'Histogram Calculation'],['https://docs.opencv.org/4.2.0/d8/dbc/tutorial_histogram_calculation.html',1,'Histogram Calculation']]], - ['histogram_20comparison_416',['Histogram Comparison',['https://docs.opencv.org/4.2.0/d8/dc8/tutorial_histogram_comparison.html',1,'']]], - ['histogram_20equalization_417',['Histogram Equalization',['https://docs.opencv.org/4.2.0/d4/d1b/tutorial_histogram_equalization.html',1,'Histogram Equalization'],['https://docs.opencv.org/4.2.0/d5/daf/tutorial_py_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization'],['https://docs.opencv.org/4.2.0/d2/d74/tutorial_js_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization']]], - ['histogram_2ehpp_418',['histogram.hpp',['https://docs.opencv.org/4.2.0/d5/d6e/histogram_8hpp.html',1,'']]], - ['histogram_5f_419',['histogram_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaaa9fe0a5f00f232778cc092cc91f28b',1,'cv::cudev::histogram_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaaa9fe0a5f00f232778cc092cc91f28b',1,'histogram_()(Global Namespace)']]], - ['histogram_5fbins_420',['histogram_bins',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a32215ed2068c5cd1fe524f9bb67c69ea',1,'cv::TrackerCSRT::Params']]], - ['histogram_5fcalculation_2emarkdown_421',['histogram_calculation.markdown',['https://docs.opencv.org/4.2.0/d2/d3a/histogram__calculation_8markdown.html',1,'']]], - ['histogram_5fcomparison_2emarkdown_422',['histogram_comparison.markdown',['https://docs.opencv.org/4.2.0/de/d12/histogram__comparison_8markdown.html',1,'']]], - ['histogram_5fequalization_2emarkdown_423',['histogram_equalization.markdown',['https://docs.opencv.org/4.2.0/db/de8/histogram__equalization_8markdown.html',1,'']]], - ['histogram_5flr_424',['histogram_lr',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a87a0492d85a62f7592ecf054e8d00044',1,'cv::TrackerCSRT::Params']]], - ['histogrambody_425',['HistogramBody',['https://docs.opencv.org/4.2.0/d9/dea/structcv_1_1cudev_1_1HistogramBody.html',1,'cv::cudev']]], - ['histogramcostextractor_426',['HistogramCostExtractor',['https://docs.opencv.org/4.2.0/df/d9a/classcv_1_1HistogramCostExtractor.html',1,'cv']]], - ['histogramnormtype_427',['HistogramNormType',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#aaf697bc744e0c0b561fa09099bb56ed8',1,'cv::HOGDescriptor']]], - ['histogramnormtype_428',['histogramNormType',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a03bb4bba3f3af82fc2674e4c3d7feb89',1,'cv::HOGDescriptor']]], - ['histogramphaseunwrapping_429',['HistogramPhaseUnwrapping',['https://docs.opencv.org/4.2.0/d5/d7d/classcv_1_1phase__unwrapping_1_1HistogramPhaseUnwrapping.html',1,'cv::phase_unwrapping']]], - ['histogramphaseunwrapping_2ehpp_430',['histogramphaseunwrapping.hpp',['https://docs.opencv.org/4.2.0/df/dce/histogramphaseunwrapping_8hpp.html',1,'']]], - ['histograms_431',['Histograms',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html',1,'']]], - ['histograms_201_20_3a_20find_20plot_20analyze_432',['Histograms 1 : Find Plot Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], - ['histograms_202_3a_20histogram_20equalization_433',['Histograms 2: Histogram Equalization',['https://docs.opencv.org/4.2.0/d5/daf/tutorial_py_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization'],['https://docs.opencv.org/4.2.0/d2/d74/tutorial_js_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization']]], - ['histograms_203_20_3a_202d_20histograms_434',['Histograms - 3 : 2D Histograms',['https://docs.opencv.org/4.2.0/dd/d0d/tutorial_py_2d_histogram.html',1,'']]], - ['histograms_20in_20opencv_435',['Histograms in OpenCV',['https://docs.opencv.org/4.2.0/de/db2/tutorial_py_table_of_contents_histograms.html',1,'']]], - ['histograms_20in_20opencv_20js_436',['Histograms in OpenCV.js',['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'']]], - ['histrange_437',['histRange',['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga87819085c1059186d9cdeacd92cea783',1,'cv::cuda::histRange(InputArray src, OutputArray hist, InputArray levels, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga8816f4cbb3e796264901f9a42eb4884d',1,'cv::cuda::histRange(InputArray src, GpuMat hist[4], const GpuMat levels[4], Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga87819085c1059186d9cdeacd92cea783',1,'histRange(InputArray src, OutputArray hist, InputArray levels, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga8816f4cbb3e796264901f9a42eb4884d',1,'histRange(InputArray src, GpuMat hist[4], const GpuMat levels[4], Stream &stream=Stream::Null())(Global Namespace)']]], - ['histthresh_438',['histThresh',['https://docs.opencv.org/4.2.0/d6/d86/structcv_1_1phase__unwrapping_1_1HistogramPhaseUnwrapping_1_1Params.html#ad0579ce3497d8602525cdaff0543029d',1,'cv::phase_unwrapping::HistogramPhaseUnwrapping::Params']]], - ['hit_20or_20miss_439',['Hit-or-Miss',['https://docs.opencv.org/4.2.0/db/d06/tutorial_hitOrMiss.html',1,'']]], - ['hitormiss_2emarkdown_440',['hitOrMiss.markdown',['https://docs.opencv.org/4.2.0/d2/dbf/hitOrMiss_8markdown.html',1,'']]], - ['hlexists_441',['hlexists',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#add5b1b96093a2a28994627cd545e3d9e',1,'cv::hdf::HDF5']]], - ['hls2rgb_442',['HLS2RGB',['https://docs.opencv.org/4.2.0/d2/d84/classcv_1_1cudev_1_1color__cvt__detail_1_1HLS2RGB.html',1,'cv::cudev::color_cvt_detail']]], - ['hls4_5fto_5fbgr_5f_443',['HLS4_to_BGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacfecfbd5c0dedca9e2243fbea25f051',1,'cv::cudev::HLS4_to_BGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacfecfbd5c0dedca9e2243fbea25f051',1,'HLS4_to_BGR_()(Global Namespace)']]], - ['hls4_5fto_5fbgr_5ffull_5f_444',['HLS4_to_BGR_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba56819118bdea68dd87814e699187c8',1,'cv::cudev::HLS4_to_BGR_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba56819118bdea68dd87814e699187c8',1,'HLS4_to_BGR_FULL_()(Global Namespace)']]], - ['hls4_5fto_5fbgr_5ffull_5ffunc_445',['HLS4_to_BGR_FULL_func',['https://docs.opencv.org/4.2.0/d2/db3/structcv_1_1cudev_1_1HLS4__to__BGR__FULL__func.html',1,'cv::cudev']]], - ['hls4_5fto_5fbgr_5ffull_5ffunc_3c_20float_20_3e_446',['HLS4_to_BGR_FULL_func< float >',['https://docs.opencv.org/4.2.0/d5/ddb/structcv_1_1cudev_1_1HLS4__to__BGR__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls4_5fto_5fbgr_5ffunc_447',['HLS4_to_BGR_func',['https://docs.opencv.org/4.2.0/d4/dde/structcv_1_1cudev_1_1HLS4__to__BGR__func.html',1,'cv::cudev']]], - ['hls4_5fto_5fbgr_5ffunc_3c_20float_20_3e_448',['HLS4_to_BGR_func< float >',['https://docs.opencv.org/4.2.0/de/da3/structcv_1_1cudev_1_1HLS4__to__BGR__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls4_5fto_5fbgra_5f_449',['HLS4_to_BGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6e91554a3762a6e4a2448342953e5f2',1,'cv::cudev::HLS4_to_BGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6e91554a3762a6e4a2448342953e5f2',1,'HLS4_to_BGRA_()(Global Namespace)']]], - ['hls4_5fto_5fbgra_5ffull_5f_450',['HLS4_to_BGRA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67580e3228f8fd99a33606144397c74',1,'cv::cudev::HLS4_to_BGRA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67580e3228f8fd99a33606144397c74',1,'HLS4_to_BGRA_FULL_()(Global Namespace)']]], - ['hls4_5fto_5fbgra_5ffull_5ffunc_451',['HLS4_to_BGRA_FULL_func',['https://docs.opencv.org/4.2.0/dc/d6e/structcv_1_1cudev_1_1HLS4__to__BGRA__FULL__func.html',1,'cv::cudev']]], - ['hls4_5fto_5fbgra_5ffull_5ffunc_3c_20float_20_3e_452',['HLS4_to_BGRA_FULL_func< float >',['https://docs.opencv.org/4.2.0/d0/dba/structcv_1_1cudev_1_1HLS4__to__BGRA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls4_5fto_5fbgra_5ffunc_453',['HLS4_to_BGRA_func',['https://docs.opencv.org/4.2.0/dc/d29/structcv_1_1cudev_1_1HLS4__to__BGRA__func.html',1,'cv::cudev']]], - ['hls4_5fto_5fbgra_5ffunc_3c_20float_20_3e_454',['HLS4_to_BGRA_func< float >',['https://docs.opencv.org/4.2.0/dd/d24/structcv_1_1cudev_1_1HLS4__to__BGRA__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls4_5fto_5frgb_5f_455',['HLS4_to_RGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf081416e5b05e1ddc0c1af0086ed3aa7',1,'cv::cudev::HLS4_to_RGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf081416e5b05e1ddc0c1af0086ed3aa7',1,'HLS4_to_RGB_()(Global Namespace)']]], - ['hls4_5fto_5frgb_5ffull_5f_456',['HLS4_to_RGB_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7e7f17a637c547965172cb26ea2daec',1,'cv::cudev::HLS4_to_RGB_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7e7f17a637c547965172cb26ea2daec',1,'HLS4_to_RGB_FULL_()(Global Namespace)']]], - ['hls4_5fto_5frgb_5ffull_5ffunc_457',['HLS4_to_RGB_FULL_func',['https://docs.opencv.org/4.2.0/d5/d88/structcv_1_1cudev_1_1HLS4__to__RGB__FULL__func.html',1,'cv::cudev']]], - ['hls4_5fto_5frgb_5ffull_5ffunc_3c_20float_20_3e_458',['HLS4_to_RGB_FULL_func< float >',['https://docs.opencv.org/4.2.0/d5/d88/structcv_1_1cudev_1_1HLS4__to__RGB__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls4_5fto_5frgb_5ffunc_459',['HLS4_to_RGB_func',['https://docs.opencv.org/4.2.0/d1/d27/structcv_1_1cudev_1_1HLS4__to__RGB__func.html',1,'cv::cudev']]], - ['hls4_5fto_5frgb_5ffunc_3c_20float_20_3e_460',['HLS4_to_RGB_func< float >',['https://docs.opencv.org/4.2.0/df/d04/structcv_1_1cudev_1_1HLS4__to__RGB__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls4_5fto_5frgba_5f_461',['HLS4_to_RGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61519219d583a12848a7e88c6911d031',1,'cv::cudev::HLS4_to_RGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61519219d583a12848a7e88c6911d031',1,'HLS4_to_RGBA_()(Global Namespace)']]], - ['hls4_5fto_5frgba_5ffull_5f_462',['HLS4_to_RGBA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b5c9288839575fdcdc7c196490d1171',1,'cv::cudev::HLS4_to_RGBA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b5c9288839575fdcdc7c196490d1171',1,'HLS4_to_RGBA_FULL_()(Global Namespace)']]], - ['hls4_5fto_5frgba_5ffull_5ffunc_463',['HLS4_to_RGBA_FULL_func',['https://docs.opencv.org/4.2.0/dc/dd8/structcv_1_1cudev_1_1HLS4__to__RGBA__FULL__func.html',1,'cv::cudev']]], - ['hls4_5fto_5frgba_5ffull_5ffunc_3c_20float_20_3e_464',['HLS4_to_RGBA_FULL_func< float >',['https://docs.opencv.org/4.2.0/de/da6/structcv_1_1cudev_1_1HLS4__to__RGBA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls4_5fto_5frgba_5ffunc_465',['HLS4_to_RGBA_func',['https://docs.opencv.org/4.2.0/d5/d29/structcv_1_1cudev_1_1HLS4__to__RGBA__func.html',1,'cv::cudev']]], - ['hls4_5fto_5frgba_5ffunc_3c_20float_20_3e_466',['HLS4_to_RGBA_func< float >',['https://docs.opencv.org/4.2.0/da/de0/structcv_1_1cudev_1_1HLS4__to__RGBA__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls_5fto_5fbgr_5f_467',['HLS_to_BGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20d834c8850d7295aa4165e60d1f2654',1,'cv::cudev::HLS_to_BGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20d834c8850d7295aa4165e60d1f2654',1,'HLS_to_BGR_()(Global Namespace)']]], - ['hls_5fto_5fbgr_5ffull_5f_468',['HLS_to_BGR_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec38eeaba078e0a55e8ea3838ed71160',1,'cv::cudev::HLS_to_BGR_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec38eeaba078e0a55e8ea3838ed71160',1,'HLS_to_BGR_FULL_()(Global Namespace)']]], - ['hls_5fto_5fbgr_5ffull_5ffunc_469',['HLS_to_BGR_FULL_func',['https://docs.opencv.org/4.2.0/db/d9e/structcv_1_1cudev_1_1HLS__to__BGR__FULL__func.html',1,'cv::cudev']]], - ['hls_5fto_5fbgr_5ffull_5ffunc_3c_20float_20_3e_470',['HLS_to_BGR_FULL_func< float >',['https://docs.opencv.org/4.2.0/db/d14/structcv_1_1cudev_1_1HLS__to__BGR__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls_5fto_5fbgr_5ffunc_471',['HLS_to_BGR_func',['https://docs.opencv.org/4.2.0/d9/d86/structcv_1_1cudev_1_1HLS__to__BGR__func.html',1,'cv::cudev']]], - ['hls_5fto_5fbgr_5ffunc_3c_20float_20_3e_472',['HLS_to_BGR_func< float >',['https://docs.opencv.org/4.2.0/de/d3e/structcv_1_1cudev_1_1HLS__to__BGR__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls_5fto_5fbgra_5f_473',['HLS_to_BGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97fcf24d639aeb5fa111025430864234',1,'cv::cudev::HLS_to_BGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97fcf24d639aeb5fa111025430864234',1,'HLS_to_BGRA_()(Global Namespace)']]], - ['hls_5fto_5fbgra_5ffull_5f_474',['HLS_to_BGRA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa80ae5cfb30ecf60d187bec063c1dd74',1,'cv::cudev::HLS_to_BGRA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa80ae5cfb30ecf60d187bec063c1dd74',1,'HLS_to_BGRA_FULL_()(Global Namespace)']]], - ['hls_5fto_5fbgra_5ffull_5ffunc_475',['HLS_to_BGRA_FULL_func',['https://docs.opencv.org/4.2.0/d7/d9e/structcv_1_1cudev_1_1HLS__to__BGRA__FULL__func.html',1,'cv::cudev']]], - ['hls_5fto_5fbgra_5ffull_5ffunc_3c_20float_20_3e_476',['HLS_to_BGRA_FULL_func< float >',['https://docs.opencv.org/4.2.0/dc/de8/structcv_1_1cudev_1_1HLS__to__BGRA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls_5fto_5fbgra_5ffunc_477',['HLS_to_BGRA_func',['https://docs.opencv.org/4.2.0/df/d5d/structcv_1_1cudev_1_1HLS__to__BGRA__func.html',1,'cv::cudev']]], - ['hls_5fto_5fbgra_5ffunc_3c_20float_20_3e_478',['HLS_to_BGRA_func< float >',['https://docs.opencv.org/4.2.0/d8/d50/structcv_1_1cudev_1_1HLS__to__BGRA__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls_5fto_5frgb_5f_479',['HLS_to_RGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d10ecf38bf14436f460def6bc280607',1,'cv::cudev::HLS_to_RGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d10ecf38bf14436f460def6bc280607',1,'HLS_to_RGB_()(Global Namespace)']]], - ['hls_5fto_5frgb_5ffull_5f_480',['HLS_to_RGB_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8ec1161280f3374fb67feb4f822c56f',1,'cv::cudev::HLS_to_RGB_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8ec1161280f3374fb67feb4f822c56f',1,'HLS_to_RGB_FULL_()(Global Namespace)']]], - ['hls_5fto_5frgb_5ffull_5ffunc_481',['HLS_to_RGB_FULL_func',['https://docs.opencv.org/4.2.0/d0/d6f/structcv_1_1cudev_1_1HLS__to__RGB__FULL__func.html',1,'cv::cudev']]], - ['hls_5fto_5frgb_5ffull_5ffunc_3c_20float_20_3e_482',['HLS_to_RGB_FULL_func< float >',['https://docs.opencv.org/4.2.0/d8/d54/structcv_1_1cudev_1_1HLS__to__RGB__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls_5fto_5frgb_5ffunc_483',['HLS_to_RGB_func',['https://docs.opencv.org/4.2.0/d1/daf/structcv_1_1cudev_1_1HLS__to__RGB__func.html',1,'cv::cudev']]], - ['hls_5fto_5frgb_5ffunc_3c_20float_20_3e_484',['HLS_to_RGB_func< float >',['https://docs.opencv.org/4.2.0/d4/d65/structcv_1_1cudev_1_1HLS__to__RGB__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls_5fto_5frgba_5f_485',['HLS_to_RGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0bed833d7f91452f0c8b829f386e19e',1,'cv::cudev::HLS_to_RGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0bed833d7f91452f0c8b829f386e19e',1,'HLS_to_RGBA_()(Global Namespace)']]], - ['hls_5fto_5frgba_5ffull_5f_486',['HLS_to_RGBA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26ef698c3d197bf6ae6fb795e44d25f8',1,'cv::cudev::HLS_to_RGBA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26ef698c3d197bf6ae6fb795e44d25f8',1,'HLS_to_RGBA_FULL_()(Global Namespace)']]], - ['hls_5fto_5frgba_5ffull_5ffunc_487',['HLS_to_RGBA_FULL_func',['https://docs.opencv.org/4.2.0/d9/d0d/structcv_1_1cudev_1_1HLS__to__RGBA__FULL__func.html',1,'cv::cudev']]], - ['hls_5fto_5frgba_5ffull_5ffunc_3c_20float_20_3e_488',['HLS_to_RGBA_FULL_func< float >',['https://docs.opencv.org/4.2.0/d9/da1/structcv_1_1cudev_1_1HLS__to__RGBA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hls_5fto_5frgba_5ffunc_489',['HLS_to_RGBA_func',['https://docs.opencv.org/4.2.0/dc/d45/structcv_1_1cudev_1_1HLS__to__RGBA__func.html',1,'cv::cudev']]], - ['hls_5fto_5frgba_5ffunc_3c_20float_20_3e_490',['HLS_to_RGBA_func< float >',['https://docs.opencv.org/4.2.0/d9/d0e/structcv_1_1cudev_1_1HLS__to__RGBA__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hnormalized_491',['hnormalized',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gadc0e3dd3510cb5a6e70aca9aab1cbf19',1,'Eigen::MatrixBase::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gadc0e3dd3510cb5a6e70aca9aab1cbf19',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gadc0e3dd3510cb5a6e70aca9aab1cbf19',1,'MatrixBase< Solve< Decomposition, RhsType > >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'Eigen::VectorwiseOp::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const Derived, Horizontal >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const Derived, Vertical >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gadc0e3dd3510cb5a6e70aca9aab1cbf19',1,'hnormalized()(Global Namespace)']]], - ['hog_492',['HOG',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html',1,'cv::cuda::HOG'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#aebd27314d1f03cb2b770888fb9d45b18ad50f91968aca5707fee6d364ef1b2d37',1,'cv::CvFeatureParams::HOG']]], - ['hog_5fclip_493',['hog_clip',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#ab3f74654aab04dd1e954a92a09e1c40a',1,'cv::TrackerCSRT::Params']]], - ['hog_5forientations_494',['hog_orientations',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#af5cb507efd9c685dd6f2893ca103ca24',1,'cv::TrackerCSRT::Params']]], - ['hogdescriptor_495',['HOGDescriptor',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html',1,'cv::HOGDescriptor'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a723b95b709cfd3f95cf9e616de988fc8',1,'cv::HOGDescriptor::HOGDescriptor()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a5c8e8ce0578512fe80493ed3ed88ca83',1,'cv::HOGDescriptor::HOGDescriptor(Size _winSize, Size _blockSize, Size _blockStride, Size _cellSize, int _nbins, int _derivAperture=1, double _winSigma=-1, HOGDescriptor::HistogramNormType _histogramNormType=HOGDescriptor::L2Hys, double _L2HysThreshold=0.2, bool _gammaCorrection=false, int _nlevels=HOGDescriptor::DEFAULT_NLEVELS, bool _signedGradient=false)'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a32a635936edaed1b2789caf3dcb09b6e',1,'cv::HOGDescriptor::HOGDescriptor(const String &filename)'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#abb90ac4bb8220c44bb5a7e796113e51e',1,'cv::HOGDescriptor::HOGDescriptor(const HOGDescriptor &d)']]], - ['holds_496',['holds',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#ae31f86a611b82d0177e583fcbf06eee4',1,'cv::detail::GArrayU']]], - ['holds_5falternative_497',['holds_alternative',['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a2d33fc6eb38576b151326991529ce403',1,'cv::util']]], - ['hole_5farea_5fratio_498',['hole_area_ratio',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a00ec10ed2344021eddd593b09e1b857a',1,'cv::text::ERStat']]], - ['homogeneous_499',['Homogeneous',['https://eigen.tuxfamily.org/dox/classEigen_1_1Homogeneous.html',1,'Eigen']]], - ['homogeneous_500',['homogeneous',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf3229c2d3669e983075ab91f7f480cb1',1,'Eigen::MatrixBase::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf3229c2d3669e983075ab91f7f480cb1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf3229c2d3669e983075ab91f7f480cb1',1,'MatrixBase< Solve< Decomposition, RhsType > >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'Eigen::VectorwiseOp::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const Derived, Horizontal >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const Derived, Vertical >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf3229c2d3669e983075ab91f7f480cb1',1,'homogeneous()(Global Namespace)']]], - ['homogeneoustoeuclidean_501',['homogeneousToEuclidean',['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#gafe4dd53eb700167a5c4ad51375cb2442',1,'cv::sfm::homogeneousToEuclidean()'],['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#gafe4dd53eb700167a5c4ad51375cb2442',1,'homogeneousToEuclidean(InputArray src, OutputArray dst)(Global Namespace)']]], - ['homography_20explained_20with_20code_502',['Basic concepts of the homography explained with code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'']]], - ['homography_20to_20find_20a_20known_20object_503',['Features2D + Homography to find a known object',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_feature_homography.html',1,'']]], - ['homography_20to_20find_20objects_504',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], - ['homography_2emarkdown_505',['homography.markdown',['https://docs.opencv.org/4.2.0/d2/dc8/homography_8markdown.html',1,'']]], - ['homographybasedestimator_506',['HomographyBasedEstimator',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1detail_1_1HomographyBasedEstimator.html',1,'cv::detail::HomographyBasedEstimator'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1detail_1_1HomographyBasedEstimator.html#a1721c1881d881d337c7ffb1615ac508c',1,'cv::detail::HomographyBasedEstimator::HomographyBasedEstimator()']]], - ['horizontal_507',['horizontal',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#ae7297d16cebc75ef79f227730c651cf1',1,'cv::structured_light::SinusoidalPattern::Params']]], + ['histogram_20backprojection_415',['Histogram Backprojection',['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_histogram_backprojection.html',1,'Histogram - 3 : Histogram Backprojection'],['https://docs.opencv.org/4.2.0/dc/df6/tutorial_py_histogram_backprojection.html',1,'Histogram - 4 : Histogram Backprojection']]], + ['histogram_20calculation_416',['Histogram Calculation',['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html',1,'Histogram Calculation'],['https://docs.opencv.org/4.2.0/d8/dbc/tutorial_histogram_calculation.html',1,'Histogram Calculation']]], + ['histogram_20comparison_417',['Histogram Comparison',['https://docs.opencv.org/4.2.0/d8/dc8/tutorial_histogram_comparison.html',1,'']]], + ['histogram_20equalization_418',['Histogram Equalization',['https://docs.opencv.org/4.2.0/d4/d1b/tutorial_histogram_equalization.html',1,'Histogram Equalization'],['https://docs.opencv.org/4.2.0/d5/daf/tutorial_py_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization'],['https://docs.opencv.org/4.2.0/d2/d74/tutorial_js_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization']]], + ['histogram_2ehpp_419',['histogram.hpp',['https://docs.opencv.org/4.2.0/d5/d6e/histogram_8hpp.html',1,'']]], + ['histogram_5f_420',['histogram_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaaa9fe0a5f00f232778cc092cc91f28b',1,'cv::cudev::histogram_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaaa9fe0a5f00f232778cc092cc91f28b',1,'histogram_()(Global Namespace)']]], + ['histogram_5fbins_421',['histogram_bins',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a32215ed2068c5cd1fe524f9bb67c69ea',1,'cv::TrackerCSRT::Params']]], + ['histogram_5fcalculation_2emarkdown_422',['histogram_calculation.markdown',['https://docs.opencv.org/4.2.0/d2/d3a/histogram__calculation_8markdown.html',1,'']]], + ['histogram_5fcomparison_2emarkdown_423',['histogram_comparison.markdown',['https://docs.opencv.org/4.2.0/de/d12/histogram__comparison_8markdown.html',1,'']]], + ['histogram_5fequalization_2emarkdown_424',['histogram_equalization.markdown',['https://docs.opencv.org/4.2.0/db/de8/histogram__equalization_8markdown.html',1,'']]], + ['histogram_5flr_425',['histogram_lr',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a87a0492d85a62f7592ecf054e8d00044',1,'cv::TrackerCSRT::Params']]], + ['histogrambody_426',['HistogramBody',['https://docs.opencv.org/4.2.0/d9/dea/structcv_1_1cudev_1_1HistogramBody.html',1,'cv::cudev']]], + ['histogramcostextractor_427',['HistogramCostExtractor',['https://docs.opencv.org/4.2.0/df/d9a/classcv_1_1HistogramCostExtractor.html',1,'cv']]], + ['histogramnormtype_428',['HistogramNormType',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#aaf697bc744e0c0b561fa09099bb56ed8',1,'cv::HOGDescriptor']]], + ['histogramnormtype_429',['histogramNormType',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a03bb4bba3f3af82fc2674e4c3d7feb89',1,'cv::HOGDescriptor']]], + ['histogramphaseunwrapping_430',['HistogramPhaseUnwrapping',['https://docs.opencv.org/4.2.0/d5/d7d/classcv_1_1phase__unwrapping_1_1HistogramPhaseUnwrapping.html',1,'cv::phase_unwrapping']]], + ['histogramphaseunwrapping_2ehpp_431',['histogramphaseunwrapping.hpp',['https://docs.opencv.org/4.2.0/df/dce/histogramphaseunwrapping_8hpp.html',1,'']]], + ['histograms_432',['Histograms',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html',1,'Histograms'],['https://docs.opencv.org/4.2.0/dd/d0d/tutorial_py_2d_histogram.html',1,'Histograms - 3 : 2D Histograms']]], + ['histograms_201_20_3a_20find_20plot_20analyze_433',['Histograms 1 : Find Plot Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], + ['histograms_202_3a_20histogram_20equalization_434',['Histograms 2: Histogram Equalization',['https://docs.opencv.org/4.2.0/d5/daf/tutorial_py_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization'],['https://docs.opencv.org/4.2.0/d2/d74/tutorial_js_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization']]], + ['histograms_203_20_3a_202d_20histograms_435',['Histograms - 3 : 2D Histograms',['https://docs.opencv.org/4.2.0/dd/d0d/tutorial_py_2d_histogram.html',1,'']]], + ['histograms_20in_20opencv_436',['Histograms in OpenCV',['https://docs.opencv.org/4.2.0/de/db2/tutorial_py_table_of_contents_histograms.html',1,'']]], + ['histograms_20in_20opencv_20js_437',['Histograms in OpenCV.js',['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'']]], + ['histrange_438',['histRange',['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga87819085c1059186d9cdeacd92cea783',1,'cv::cuda::histRange(InputArray src, OutputArray hist, InputArray levels, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga8816f4cbb3e796264901f9a42eb4884d',1,'cv::cuda::histRange(InputArray src, GpuMat hist[4], const GpuMat levels[4], Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga87819085c1059186d9cdeacd92cea783',1,'histRange(InputArray src, OutputArray hist, InputArray levels, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga8816f4cbb3e796264901f9a42eb4884d',1,'histRange(InputArray src, GpuMat hist[4], const GpuMat levels[4], Stream &stream=Stream::Null())(Global Namespace)']]], + ['histthresh_439',['histThresh',['https://docs.opencv.org/4.2.0/d6/d86/structcv_1_1phase__unwrapping_1_1HistogramPhaseUnwrapping_1_1Params.html#ad0579ce3497d8602525cdaff0543029d',1,'cv::phase_unwrapping::HistogramPhaseUnwrapping::Params']]], + ['hit_20or_20miss_440',['Hit-or-Miss',['https://docs.opencv.org/4.2.0/db/d06/tutorial_hitOrMiss.html',1,'']]], + ['hitormiss_2emarkdown_441',['hitOrMiss.markdown',['https://docs.opencv.org/4.2.0/d2/dbf/hitOrMiss_8markdown.html',1,'']]], + ['hlexists_442',['hlexists',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#add5b1b96093a2a28994627cd545e3d9e',1,'cv::hdf::HDF5']]], + ['hls2rgb_443',['HLS2RGB',['https://docs.opencv.org/4.2.0/d2/d84/classcv_1_1cudev_1_1color__cvt__detail_1_1HLS2RGB.html',1,'cv::cudev::color_cvt_detail']]], + ['hls4_5fto_5fbgr_5f_444',['HLS4_to_BGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacfecfbd5c0dedca9e2243fbea25f051',1,'cv::cudev::HLS4_to_BGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacfecfbd5c0dedca9e2243fbea25f051',1,'HLS4_to_BGR_()(Global Namespace)']]], + ['hls4_5fto_5fbgr_5ffull_5f_445',['HLS4_to_BGR_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba56819118bdea68dd87814e699187c8',1,'cv::cudev::HLS4_to_BGR_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba56819118bdea68dd87814e699187c8',1,'HLS4_to_BGR_FULL_()(Global Namespace)']]], + ['hls4_5fto_5fbgr_5ffull_5ffunc_446',['HLS4_to_BGR_FULL_func',['https://docs.opencv.org/4.2.0/d2/db3/structcv_1_1cudev_1_1HLS4__to__BGR__FULL__func.html',1,'cv::cudev']]], + ['hls4_5fto_5fbgr_5ffull_5ffunc_3c_20float_20_3e_447',['HLS4_to_BGR_FULL_func< float >',['https://docs.opencv.org/4.2.0/d5/ddb/structcv_1_1cudev_1_1HLS4__to__BGR__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls4_5fto_5fbgr_5ffunc_448',['HLS4_to_BGR_func',['https://docs.opencv.org/4.2.0/d4/dde/structcv_1_1cudev_1_1HLS4__to__BGR__func.html',1,'cv::cudev']]], + ['hls4_5fto_5fbgr_5ffunc_3c_20float_20_3e_449',['HLS4_to_BGR_func< float >',['https://docs.opencv.org/4.2.0/de/da3/structcv_1_1cudev_1_1HLS4__to__BGR__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls4_5fto_5fbgra_5f_450',['HLS4_to_BGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6e91554a3762a6e4a2448342953e5f2',1,'cv::cudev::HLS4_to_BGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6e91554a3762a6e4a2448342953e5f2',1,'HLS4_to_BGRA_()(Global Namespace)']]], + ['hls4_5fto_5fbgra_5ffull_5f_451',['HLS4_to_BGRA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67580e3228f8fd99a33606144397c74',1,'cv::cudev::HLS4_to_BGRA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67580e3228f8fd99a33606144397c74',1,'HLS4_to_BGRA_FULL_()(Global Namespace)']]], + ['hls4_5fto_5fbgra_5ffull_5ffunc_452',['HLS4_to_BGRA_FULL_func',['https://docs.opencv.org/4.2.0/dc/d6e/structcv_1_1cudev_1_1HLS4__to__BGRA__FULL__func.html',1,'cv::cudev']]], + ['hls4_5fto_5fbgra_5ffull_5ffunc_3c_20float_20_3e_453',['HLS4_to_BGRA_FULL_func< float >',['https://docs.opencv.org/4.2.0/d0/dba/structcv_1_1cudev_1_1HLS4__to__BGRA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls4_5fto_5fbgra_5ffunc_454',['HLS4_to_BGRA_func',['https://docs.opencv.org/4.2.0/dc/d29/structcv_1_1cudev_1_1HLS4__to__BGRA__func.html',1,'cv::cudev']]], + ['hls4_5fto_5fbgra_5ffunc_3c_20float_20_3e_455',['HLS4_to_BGRA_func< float >',['https://docs.opencv.org/4.2.0/dd/d24/structcv_1_1cudev_1_1HLS4__to__BGRA__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls4_5fto_5frgb_5f_456',['HLS4_to_RGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf081416e5b05e1ddc0c1af0086ed3aa7',1,'cv::cudev::HLS4_to_RGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf081416e5b05e1ddc0c1af0086ed3aa7',1,'HLS4_to_RGB_()(Global Namespace)']]], + ['hls4_5fto_5frgb_5ffull_5f_457',['HLS4_to_RGB_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7e7f17a637c547965172cb26ea2daec',1,'cv::cudev::HLS4_to_RGB_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7e7f17a637c547965172cb26ea2daec',1,'HLS4_to_RGB_FULL_()(Global Namespace)']]], + ['hls4_5fto_5frgb_5ffull_5ffunc_458',['HLS4_to_RGB_FULL_func',['https://docs.opencv.org/4.2.0/d5/d88/structcv_1_1cudev_1_1HLS4__to__RGB__FULL__func.html',1,'cv::cudev']]], + ['hls4_5fto_5frgb_5ffull_5ffunc_3c_20float_20_3e_459',['HLS4_to_RGB_FULL_func< float >',['https://docs.opencv.org/4.2.0/d5/d88/structcv_1_1cudev_1_1HLS4__to__RGB__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls4_5fto_5frgb_5ffunc_460',['HLS4_to_RGB_func',['https://docs.opencv.org/4.2.0/d1/d27/structcv_1_1cudev_1_1HLS4__to__RGB__func.html',1,'cv::cudev']]], + ['hls4_5fto_5frgb_5ffunc_3c_20float_20_3e_461',['HLS4_to_RGB_func< float >',['https://docs.opencv.org/4.2.0/df/d04/structcv_1_1cudev_1_1HLS4__to__RGB__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls4_5fto_5frgba_5f_462',['HLS4_to_RGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61519219d583a12848a7e88c6911d031',1,'cv::cudev::HLS4_to_RGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61519219d583a12848a7e88c6911d031',1,'HLS4_to_RGBA_()(Global Namespace)']]], + ['hls4_5fto_5frgba_5ffull_5f_463',['HLS4_to_RGBA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b5c9288839575fdcdc7c196490d1171',1,'cv::cudev::HLS4_to_RGBA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b5c9288839575fdcdc7c196490d1171',1,'HLS4_to_RGBA_FULL_()(Global Namespace)']]], + ['hls4_5fto_5frgba_5ffull_5ffunc_464',['HLS4_to_RGBA_FULL_func',['https://docs.opencv.org/4.2.0/dc/dd8/structcv_1_1cudev_1_1HLS4__to__RGBA__FULL__func.html',1,'cv::cudev']]], + ['hls4_5fto_5frgba_5ffull_5ffunc_3c_20float_20_3e_465',['HLS4_to_RGBA_FULL_func< float >',['https://docs.opencv.org/4.2.0/de/da6/structcv_1_1cudev_1_1HLS4__to__RGBA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls4_5fto_5frgba_5ffunc_466',['HLS4_to_RGBA_func',['https://docs.opencv.org/4.2.0/d5/d29/structcv_1_1cudev_1_1HLS4__to__RGBA__func.html',1,'cv::cudev']]], + ['hls4_5fto_5frgba_5ffunc_3c_20float_20_3e_467',['HLS4_to_RGBA_func< float >',['https://docs.opencv.org/4.2.0/da/de0/structcv_1_1cudev_1_1HLS4__to__RGBA__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls_5fto_5fbgr_5f_468',['HLS_to_BGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20d834c8850d7295aa4165e60d1f2654',1,'cv::cudev::HLS_to_BGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20d834c8850d7295aa4165e60d1f2654',1,'HLS_to_BGR_()(Global Namespace)']]], + ['hls_5fto_5fbgr_5ffull_5f_469',['HLS_to_BGR_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec38eeaba078e0a55e8ea3838ed71160',1,'cv::cudev::HLS_to_BGR_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec38eeaba078e0a55e8ea3838ed71160',1,'HLS_to_BGR_FULL_()(Global Namespace)']]], + ['hls_5fto_5fbgr_5ffull_5ffunc_470',['HLS_to_BGR_FULL_func',['https://docs.opencv.org/4.2.0/db/d9e/structcv_1_1cudev_1_1HLS__to__BGR__FULL__func.html',1,'cv::cudev']]], + ['hls_5fto_5fbgr_5ffull_5ffunc_3c_20float_20_3e_471',['HLS_to_BGR_FULL_func< float >',['https://docs.opencv.org/4.2.0/db/d14/structcv_1_1cudev_1_1HLS__to__BGR__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls_5fto_5fbgr_5ffunc_472',['HLS_to_BGR_func',['https://docs.opencv.org/4.2.0/d9/d86/structcv_1_1cudev_1_1HLS__to__BGR__func.html',1,'cv::cudev']]], + ['hls_5fto_5fbgr_5ffunc_3c_20float_20_3e_473',['HLS_to_BGR_func< float >',['https://docs.opencv.org/4.2.0/de/d3e/structcv_1_1cudev_1_1HLS__to__BGR__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls_5fto_5fbgra_5f_474',['HLS_to_BGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97fcf24d639aeb5fa111025430864234',1,'cv::cudev::HLS_to_BGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97fcf24d639aeb5fa111025430864234',1,'HLS_to_BGRA_()(Global Namespace)']]], + ['hls_5fto_5fbgra_5ffull_5f_475',['HLS_to_BGRA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa80ae5cfb30ecf60d187bec063c1dd74',1,'cv::cudev::HLS_to_BGRA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa80ae5cfb30ecf60d187bec063c1dd74',1,'HLS_to_BGRA_FULL_()(Global Namespace)']]], + ['hls_5fto_5fbgra_5ffull_5ffunc_476',['HLS_to_BGRA_FULL_func',['https://docs.opencv.org/4.2.0/d7/d9e/structcv_1_1cudev_1_1HLS__to__BGRA__FULL__func.html',1,'cv::cudev']]], + ['hls_5fto_5fbgra_5ffull_5ffunc_3c_20float_20_3e_477',['HLS_to_BGRA_FULL_func< float >',['https://docs.opencv.org/4.2.0/dc/de8/structcv_1_1cudev_1_1HLS__to__BGRA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls_5fto_5fbgra_5ffunc_478',['HLS_to_BGRA_func',['https://docs.opencv.org/4.2.0/df/d5d/structcv_1_1cudev_1_1HLS__to__BGRA__func.html',1,'cv::cudev']]], + ['hls_5fto_5fbgra_5ffunc_3c_20float_20_3e_479',['HLS_to_BGRA_func< float >',['https://docs.opencv.org/4.2.0/d8/d50/structcv_1_1cudev_1_1HLS__to__BGRA__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls_5fto_5frgb_5f_480',['HLS_to_RGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d10ecf38bf14436f460def6bc280607',1,'cv::cudev::HLS_to_RGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d10ecf38bf14436f460def6bc280607',1,'HLS_to_RGB_()(Global Namespace)']]], + ['hls_5fto_5frgb_5ffull_5f_481',['HLS_to_RGB_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8ec1161280f3374fb67feb4f822c56f',1,'cv::cudev::HLS_to_RGB_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8ec1161280f3374fb67feb4f822c56f',1,'HLS_to_RGB_FULL_()(Global Namespace)']]], + ['hls_5fto_5frgb_5ffull_5ffunc_482',['HLS_to_RGB_FULL_func',['https://docs.opencv.org/4.2.0/d0/d6f/structcv_1_1cudev_1_1HLS__to__RGB__FULL__func.html',1,'cv::cudev']]], + ['hls_5fto_5frgb_5ffull_5ffunc_3c_20float_20_3e_483',['HLS_to_RGB_FULL_func< float >',['https://docs.opencv.org/4.2.0/d8/d54/structcv_1_1cudev_1_1HLS__to__RGB__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls_5fto_5frgb_5ffunc_484',['HLS_to_RGB_func',['https://docs.opencv.org/4.2.0/d1/daf/structcv_1_1cudev_1_1HLS__to__RGB__func.html',1,'cv::cudev']]], + ['hls_5fto_5frgb_5ffunc_3c_20float_20_3e_485',['HLS_to_RGB_func< float >',['https://docs.opencv.org/4.2.0/d4/d65/structcv_1_1cudev_1_1HLS__to__RGB__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls_5fto_5frgba_5f_486',['HLS_to_RGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0bed833d7f91452f0c8b829f386e19e',1,'cv::cudev::HLS_to_RGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0bed833d7f91452f0c8b829f386e19e',1,'HLS_to_RGBA_()(Global Namespace)']]], + ['hls_5fto_5frgba_5ffull_5f_487',['HLS_to_RGBA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26ef698c3d197bf6ae6fb795e44d25f8',1,'cv::cudev::HLS_to_RGBA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26ef698c3d197bf6ae6fb795e44d25f8',1,'HLS_to_RGBA_FULL_()(Global Namespace)']]], + ['hls_5fto_5frgba_5ffull_5ffunc_488',['HLS_to_RGBA_FULL_func',['https://docs.opencv.org/4.2.0/d9/d0d/structcv_1_1cudev_1_1HLS__to__RGBA__FULL__func.html',1,'cv::cudev']]], + ['hls_5fto_5frgba_5ffull_5ffunc_3c_20float_20_3e_489',['HLS_to_RGBA_FULL_func< float >',['https://docs.opencv.org/4.2.0/d9/da1/structcv_1_1cudev_1_1HLS__to__RGBA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hls_5fto_5frgba_5ffunc_490',['HLS_to_RGBA_func',['https://docs.opencv.org/4.2.0/dc/d45/structcv_1_1cudev_1_1HLS__to__RGBA__func.html',1,'cv::cudev']]], + ['hls_5fto_5frgba_5ffunc_3c_20float_20_3e_491',['HLS_to_RGBA_func< float >',['https://docs.opencv.org/4.2.0/d9/d0e/structcv_1_1cudev_1_1HLS__to__RGBA__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hnormalized_492',['hnormalized',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gadc0e3dd3510cb5a6e70aca9aab1cbf19',1,'Eigen::MatrixBase::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gadc0e3dd3510cb5a6e70aca9aab1cbf19',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gadc0e3dd3510cb5a6e70aca9aab1cbf19',1,'MatrixBase< Solve< Decomposition, RhsType > >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'Eigen::VectorwiseOp::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const Derived, Horizontal >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const Derived, Vertical >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga1f220045efa302626c287088b63b6ba9',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::hnormalized()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gadc0e3dd3510cb5a6e70aca9aab1cbf19',1,'hnormalized()(Global Namespace)']]], + ['hog_493',['HOG',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html',1,'cv::cuda::HOG'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#aebd27314d1f03cb2b770888fb9d45b18ad50f91968aca5707fee6d364ef1b2d37',1,'cv::CvFeatureParams::HOG']]], + ['hog_5fclip_494',['hog_clip',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#ab3f74654aab04dd1e954a92a09e1c40a',1,'cv::TrackerCSRT::Params']]], + ['hog_5forientations_495',['hog_orientations',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#af5cb507efd9c685dd6f2893ca103ca24',1,'cv::TrackerCSRT::Params']]], + ['hogdescriptor_496',['HOGDescriptor',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html',1,'cv::HOGDescriptor'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a723b95b709cfd3f95cf9e616de988fc8',1,'cv::HOGDescriptor::HOGDescriptor()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a5c8e8ce0578512fe80493ed3ed88ca83',1,'cv::HOGDescriptor::HOGDescriptor(Size _winSize, Size _blockSize, Size _blockStride, Size _cellSize, int _nbins, int _derivAperture=1, double _winSigma=-1, HOGDescriptor::HistogramNormType _histogramNormType=HOGDescriptor::L2Hys, double _L2HysThreshold=0.2, bool _gammaCorrection=false, int _nlevels=HOGDescriptor::DEFAULT_NLEVELS, bool _signedGradient=false)'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a32a635936edaed1b2789caf3dcb09b6e',1,'cv::HOGDescriptor::HOGDescriptor(const String &filename)'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#abb90ac4bb8220c44bb5a7e796113e51e',1,'cv::HOGDescriptor::HOGDescriptor(const HOGDescriptor &d)']]], + ['holds_497',['holds',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#ae31f86a611b82d0177e583fcbf06eee4',1,'cv::detail::GArrayU']]], + ['holds_5falternative_498',['holds_alternative',['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a2d33fc6eb38576b151326991529ce403',1,'cv::util']]], + ['hole_5farea_5fratio_499',['hole_area_ratio',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a00ec10ed2344021eddd593b09e1b857a',1,'cv::text::ERStat']]], + ['homogeneous_500',['Homogeneous',['https://eigen.tuxfamily.org/dox/classEigen_1_1Homogeneous.html',1,'Eigen']]], + ['homogeneous_501',['homogeneous',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf3229c2d3669e983075ab91f7f480cb1',1,'Eigen::MatrixBase::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf3229c2d3669e983075ab91f7f480cb1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf3229c2d3669e983075ab91f7f480cb1',1,'MatrixBase< Solve< Decomposition, RhsType > >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'Eigen::VectorwiseOp::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const Derived, Horizontal >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const Derived, Vertical >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf99305a3d7432318236df7b80022df37',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::homogeneous()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaf3229c2d3669e983075ab91f7f480cb1',1,'homogeneous()(Global Namespace)']]], + ['homogeneoustoeuclidean_502',['homogeneousToEuclidean',['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#gafe4dd53eb700167a5c4ad51375cb2442',1,'cv::sfm::homogeneousToEuclidean()'],['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#gafe4dd53eb700167a5c4ad51375cb2442',1,'homogeneousToEuclidean(InputArray src, OutputArray dst)(Global Namespace)']]], + ['homography_20explained_20with_20code_503',['Basic concepts of the homography explained with code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'']]], + ['homography_20to_20find_20a_20known_20object_504',['Features2D + Homography to find a known object',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_feature_homography.html',1,'']]], + ['homography_20to_20find_20objects_505',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], + ['homography_2emarkdown_506',['homography.markdown',['https://docs.opencv.org/4.2.0/d2/dc8/homography_8markdown.html',1,'']]], + ['homographybasedestimator_507',['HomographyBasedEstimator',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1detail_1_1HomographyBasedEstimator.html',1,'cv::detail::HomographyBasedEstimator'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1detail_1_1HomographyBasedEstimator.html#a1721c1881d881d337c7ffb1615ac508c',1,'cv::detail::HomographyBasedEstimator::HomographyBasedEstimator()']]], ['horizontal_508',['Horizontal',['https://eigen.tuxfamily.org/dox/group__enums.html#ggad49a7b3738e273eb00932271b36127f7a961c62410157b64033839488f4d7f7e4',1,'Eigen::Horizontal'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggad49a7b3738e273eb00932271b36127f7a961c62410157b64033839488f4d7f7e4',1,'Horizontal(Global Namespace)']]], - ['horizontal_20and_20vertical_20lines_20by_20using_20morphological_20operations_509',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], - ['horizontalcellsgain_510',['horizontalCellsGain',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#ab92fe32e98d0a84c0c444b26e7e3c143',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], - ['host_5fcopy_5fobsolete_511',['HOST_COPY_OBSOLETE',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12aa335180c2d069e30096f883702476f96',1,'cv::UMatData']]], - ['host_5ftype_512',['host_type',['https://docs.opencv.org/4.2.0/da/d1b/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GArray_3_01T_01_4_01_4.html#a52ae6fd216901e8a7d6fc33614886cca',1,'cv::detail::GTypeTraits< cv::GArray< T > >']]], - ['hostcopyobsolete_513',['hostCopyObsolete',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a52b9f7ef6e7b51fd9429d50bf115ad62',1,'cv::UMatData']]], - ['hostmem_514',['HostMem',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html',1,'cv::cuda::HostMem'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#abc1d3f04e0f38e97870a944f4cfb6852',1,'cv::cuda::HostMem::HostMem(HostMem::AllocType alloc_type=HostMem::AllocType::PAGE_LOCKED)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#abddf8d1a9db3b9369841e2bf40e4b210',1,'cv::cuda::HostMem::HostMem(const HostMem &m)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a2b306f27eed3a9acb34ca1142610c4e7',1,'cv::cuda::HostMem::HostMem(int rows, int cols, int type, HostMem::AllocType alloc_type=HostMem::AllocType::PAGE_LOCKED)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a768d8b14c2db875e6db4f3b8dc7bc884',1,'cv::cuda::HostMem::HostMem(Size size, int type, HostMem::AllocType alloc_type=HostMem::AllocType::PAGE_LOCKED)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ae750a078e64922f8d3fc81a8f1edbfb8',1,'cv::cuda::HostMem::HostMem(InputArray arr, HostMem::AllocType alloc_type=HostMem::AllocType::PAGE_LOCKED)']]], - ['hostunifiedmemory_515',['hostUnifiedMemory',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a95d6767205937a8c46258a23b993395c',1,'cv::ocl::Device']]], - ['hough_20circle_20transform_516',['Hough Circle Transform',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_hough_circle.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/da/d53/tutorial_py_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d3/de5/tutorial_js_houghcircles.html',1,'Hough Circle Transform']]], - ['hough_20line_20transform_517',['Hough Line Transform',['https://docs.opencv.org/4.2.0/d9/db0/tutorial_hough_lines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d6/d10/tutorial_py_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d3/de6/tutorial_js_houghlines.html',1,'Hough Line Transform']]], - ['hough_20transform_518',['Hough Transform',['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html',1,'']]], - ['hough_5fcircle_2emarkdown_519',['hough_circle.markdown',['https://docs.opencv.org/4.2.0/d4/d67/hough__circle_8markdown.html',1,'']]], - ['hough_5fgradient_520',['HOUGH_GRADIENT',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65ab1bf00a90864db34b2f72fa76389931d',1,'cv::HOUGH_GRADIENT'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65ab1bf00a90864db34b2f72fa76389931d',1,'HOUGH_GRADIENT(Global Namespace)']]], - ['hough_5flines_2emarkdown_521',['hough_lines.markdown',['https://docs.opencv.org/4.2.0/da/d5a/hough__lines_8markdown.html',1,'']]], - ['hough_5fmulti_5fscale_522',['HOUGH_MULTI_SCALE',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65a0f81016a60d190b6987386a0b4b478e4',1,'cv::HOUGH_MULTI_SCALE'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65a0f81016a60d190b6987386a0b4b478e4',1,'HOUGH_MULTI_SCALE(Global Namespace)']]], - ['hough_5fprobabilistic_523',['HOUGH_PROBABILISTIC',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65a2af8751122d7a6df8ef14dbc0799f76c',1,'cv::HOUGH_PROBABILISTIC'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65a2af8751122d7a6df8ef14dbc0799f76c',1,'HOUGH_PROBABILISTIC(Global Namespace)']]], - ['hough_5fstandard_524',['HOUGH_STANDARD',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65aeb97ba90cb7ffac9d55c71290aa258cc',1,'cv::HOUGH_STANDARD'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65aeb97ba90cb7ffac9d55c71290aa258cc',1,'HOUGH_STANDARD(Global Namespace)']]], - ['houghcircles_525',['HoughCircles',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga47849c3be0d0406ad3ca45db65a25d2d',1,'cv::HoughCircles()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga47849c3be0d0406ad3ca45db65a25d2d',1,'HoughCircles()(Global Namespace)']]], - ['houghcirclesdetector_526',['HoughCirclesDetector',['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html',1,'cv::cuda']]], - ['houghdeskewoption_527',['HoughDeskewOption',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a63f608e1fc7cbef07a95509fcf4881d2',1,'cv::ximgproc']]], - ['houghlines_528',['HoughLines',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga46b4e588934f6c8dfd509cc6e0e4545a',1,'cv::HoughLines()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga46b4e588934f6c8dfd509cc6e0e4545a',1,'HoughLines()(Global Namespace)']]], - ['houghlinesdetector_529',['HoughLinesDetector',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html',1,'cv::cuda']]], - ['houghlinesp_530',['HoughLinesP',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga8618180a5948286384e3b7ca02f6feeb',1,'cv::HoughLinesP()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga8618180a5948286384e3b7ca02f6feeb',1,'HoughLinesP()(Global Namespace)']]], - ['houghlinespointset_531',['HoughLinesPointSet',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga2858ef61b4e47d1919facac2152a160e',1,'cv::HoughLinesPointSet()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga2858ef61b4e47d1919facac2152a160e',1,'HoughLinesPointSet()(Global Namespace)']]], - ['houghmodes_532',['HoughModes',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga073687a5b96ac7a3ab5802eb5510fe65',1,'cv::HoughModes'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga073687a5b96ac7a3ab5802eb5510fe65',1,'HoughModes(Global Namespace)']]], - ['houghop_533',['HoughOp',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a998fc1e1cca9a365651dd9917205f991',1,'cv::ximgproc']]], - ['houghpoint2line_534',['HoughPoint2Line',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#aad77c2a5fbc2a891b705911b73ea33c7',1,'cv::ximgproc']]], - ['houghsegmentdetector_535',['HoughSegmentDetector',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html',1,'cv::cuda']]], - ['hours_536',['hours',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#a52153876127e925fa042a6c728367ad3',1,'std::chrono']]], - ['householder_20module_537',['Householder module',['https://eigen.tuxfamily.org/dox/group__Householder__Module.html',1,'']]], - ['householdercoefficients_538',['householderCoefficients',['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a65fa81ce79d956baa59a30a6d82f8a84',1,'Eigen::HessenbergDecomposition::householderCoefficients()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a65fa81ce79d956baa59a30a6d82f8a84',1,'HessenbergDecomposition< MatrixType >::householderCoefficients()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#ac95b4e43dcf6c3c5074b8bea4fc67887',1,'Eigen::Tridiagonalization::householderCoefficients()']]], - ['householderq_539',['householderQ',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a28ab9d8916ca609c5469c4c192fbfa28',1,'Eigen::ColPivHouseholderQR::householderQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a28ab9d8916ca609c5469c4c192fbfa28',1,'ColPivHouseholderQR< MatrixType >::householderQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ac95b93ddad59c6e57d06fcd4737b27e1',1,'Eigen::CompleteOrthogonalDecomposition::householderQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#affd506c10ef2d25f56e7b1f9f25ff885',1,'Eigen::HouseholderQR::householderQ()']]], - ['householderqr_540',['HouseholderQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html',1,'Eigen::HouseholderQR< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#a974adb10a0e066057aeb3b360df68380',1,'Eigen::HouseholderQR::HouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#afa7cfb4faa89195c4dc8d196924c8230',1,'Eigen::HouseholderQR::HouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#a95a53f8479ee147d7b0ccab71c13e45d',1,'Eigen::HouseholderQR::HouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#a1087457610c53e1574de521a51de0cd3',1,'Eigen::HouseholderQR::HouseholderQR(Index rows, Index cols)']]], - ['householderqr_541',['householderQr',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9a9377aab1cea26db5f25bab7e682f8f',1,'Eigen::MatrixBase::householderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9a9377aab1cea26db5f25bab7e682f8f',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::householderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9a9377aab1cea26db5f25bab7e682f8f',1,'MatrixBase< Solve< Decomposition, RhsType > >::householderQr()']]], - ['householderqrpreconditioner_542',['HouseholderQRPreconditioner',['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56ea9c660eb3336bf8c77ce9d081ca07cbdd',1,'Eigen::HouseholderQRPreconditioner'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56ea9c660eb3336bf8c77ce9d081ca07cbdd',1,'HouseholderQRPreconditioner(Global Namespace)']]], - ['householdersequence_543',['HouseholderSequence',['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html',1,'Eigen::HouseholderSequence< class, class, Side >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#aa4b1b93fff4d5c79342974d9d2a9eec8',1,'Eigen::HouseholderSequence::HouseholderSequence(const HouseholderSequence &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#af6aeede87ed8dac452f4fa8b4f45c3f2',1,'Eigen::HouseholderSequence::HouseholderSequence(const VectorsType &v, const CoeffsType &h)']]], - ['householdersequence_544',['householderSequence',['https://eigen.tuxfamily.org/dox/group__Householder__Module.html#ga5f2b3f80cdf7ae96609e4a8d2e55e371',1,'Eigen::householderSequence()'],['https://eigen.tuxfamily.org/dox/group__Householder__Module.html#ga5f2b3f80cdf7ae96609e4a8d2e55e371',1,'householderSequence()(Global Namespace)']]], - ['householdersequencetype_545',['HouseholderSequenceType',['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a7c1188cd5d8f550c8941df75a50a7d08',1,'Eigen::HessenbergDecomposition::HouseholderSequenceType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a7c1188cd5d8f550c8941df75a50a7d08',1,'HessenbergDecomposition< MatrixType >::HouseholderSequenceType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#af322315c8bea9990152c9d09bfa2a69f',1,'Eigen::Tridiagonalization::HouseholderSequenceType']]], - ['how_20opencv_20python_20bindings_20works_546',['How OpenCV-Python Bindings Works?',['https://docs.opencv.org/4.2.0/da/d49/tutorial_py_bindings_basics.html',1,'']]], - ['how_20to_20build_20applications_20with_20opencv_20inside_20the_20microsoft_20visual_20studio_547',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['how_20to_20enable_20halide_20backend_20for_20improve_20efficiency_548',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], - ['how_20to_20run_20deep_20networks_20in_20browser_549',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], - ['how_20to_20run_20deep_20networks_20on_20android_20device_550',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], - ['how_20to_20scan_20images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_551',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], - ['how_20to_20schedule_20your_20network_20for_20halide_20backend_552',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], - ['how_20to_20use_20background_20subtraction_20methods_553',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], - ['how_20to_20use_20the_20opencv_20parallel_5ffor_5f_20to_20parallelize_20your_20code_554',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], - ['how_5fto_5fcreate_5fgroups_2emarkdown_555',['how_to_create_groups.markdown',['https://docs.opencv.org/4.2.0/d7/d7b/how__to__create__groups_8markdown.html',1,'']]], - ['how_5fto_5fscan_5fimages_2emarkdown_556',['how_to_scan_images.markdown',['https://docs.opencv.org/4.2.0/d5/d91/how__to__scan__images_8markdown.html',1,'']]], - ['how_5fto_5fuse_5fopencv_5fparallel_5ffor_5f_2emarkdown_557',['how_to_use_OpenCV_parallel_for_.markdown',['https://docs.opencv.org/4.2.0/d5/d45/how__to__use__OpenCV__parallel__for___8markdown.html',1,'']]], - ['hpe_5fhumaneva_558',['HPE_humaneva',['https://docs.opencv.org/4.2.0/d5/d42/classcv_1_1datasets_1_1HPE__humaneva.html',1,'cv::datasets']]], - ['hpe_5fhumaneva_2ehpp_559',['hpe_humaneva.hpp',['https://docs.opencv.org/4.2.0/d8/da7/hpe__humaneva_8hpp.html',1,'']]], - ['hpe_5fhumanevaobj_560',['HPE_humanevaObj',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html',1,'cv::datasets']]], - ['hpe_5fparse_561',['HPE_parse',['https://docs.opencv.org/4.2.0/d6/d72/classcv_1_1datasets_1_1HPE__parse.html',1,'cv::datasets']]], - ['hpe_5fparse_2ehpp_562',['hpe_parse.hpp',['https://docs.opencv.org/4.2.0/da/da9/hpe__parse_8hpp.html',1,'']]], - ['hpe_5fparseobj_563',['HPE_parseObj',['https://docs.opencv.org/4.2.0/da/d82/structcv_1_1datasets_1_1HPE__parseObj.html',1,'cv::datasets']]], - ['hscale_564',['hscale',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a6fff8d52978f53170bb05a629ed35a92',1,'cv::QtFont']]], - ['hsv2rgb_565',['HSV2RGB',['https://docs.opencv.org/4.2.0/d8/d00/classcv_1_1cudev_1_1color__cvt__detail_1_1HSV2RGB.html',1,'cv::cudev::color_cvt_detail']]], - ['hsv4_5fto_5fbgr_5f_566',['HSV4_to_BGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf26d1e940991039021870b4964b0ce7',1,'cv::cudev::HSV4_to_BGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf26d1e940991039021870b4964b0ce7',1,'HSV4_to_BGR_()(Global Namespace)']]], - ['hsv4_5fto_5fbgr_5ffull_5f_567',['HSV4_to_BGR_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfc4461b88ed1db5298c8f62fa13d430',1,'cv::cudev::HSV4_to_BGR_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfc4461b88ed1db5298c8f62fa13d430',1,'HSV4_to_BGR_FULL_()(Global Namespace)']]], - ['hsv4_5fto_5fbgr_5ffull_5ffunc_568',['HSV4_to_BGR_FULL_func',['https://docs.opencv.org/4.2.0/d9/de1/structcv_1_1cudev_1_1HSV4__to__BGR__FULL__func.html',1,'cv::cudev']]], - ['hsv4_5fto_5fbgr_5ffull_5ffunc_3c_20float_20_3e_569',['HSV4_to_BGR_FULL_func< float >',['https://docs.opencv.org/4.2.0/d6/dd7/structcv_1_1cudev_1_1HSV4__to__BGR__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv4_5fto_5fbgr_5ffunc_570',['HSV4_to_BGR_func',['https://docs.opencv.org/4.2.0/d8/d65/structcv_1_1cudev_1_1HSV4__to__BGR__func.html',1,'cv::cudev']]], - ['hsv4_5fto_5fbgr_5ffunc_3c_20float_20_3e_571',['HSV4_to_BGR_func< float >',['https://docs.opencv.org/4.2.0/d2/d2c/structcv_1_1cudev_1_1HSV4__to__BGR__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv4_5fto_5fbgra_5f_572',['HSV4_to_BGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2b7deb90fc0359bc7bad75f3d55bb09',1,'cv::cudev::HSV4_to_BGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2b7deb90fc0359bc7bad75f3d55bb09',1,'HSV4_to_BGRA_()(Global Namespace)']]], - ['hsv4_5fto_5fbgra_5ffull_5f_573',['HSV4_to_BGRA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa45f91205b1a4033d538cf3bc35481f8',1,'cv::cudev::HSV4_to_BGRA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa45f91205b1a4033d538cf3bc35481f8',1,'HSV4_to_BGRA_FULL_()(Global Namespace)']]], - ['hsv4_5fto_5fbgra_5ffull_5ffunc_574',['HSV4_to_BGRA_FULL_func',['https://docs.opencv.org/4.2.0/d7/d58/structcv_1_1cudev_1_1HSV4__to__BGRA__FULL__func.html',1,'cv::cudev']]], - ['hsv4_5fto_5fbgra_5ffull_5ffunc_3c_20float_20_3e_575',['HSV4_to_BGRA_FULL_func< float >',['https://docs.opencv.org/4.2.0/d5/d91/structcv_1_1cudev_1_1HSV4__to__BGRA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv4_5fto_5fbgra_5ffunc_576',['HSV4_to_BGRA_func',['https://docs.opencv.org/4.2.0/de/d80/structcv_1_1cudev_1_1HSV4__to__BGRA__func.html',1,'cv::cudev']]], - ['hsv4_5fto_5fbgra_5ffunc_3c_20float_20_3e_577',['HSV4_to_BGRA_func< float >',['https://docs.opencv.org/4.2.0/dc/dc6/structcv_1_1cudev_1_1HSV4__to__BGRA__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv4_5fto_5frgb_5f_578',['HSV4_to_RGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffad45b6fe24ba643e340fa0dfdf6286',1,'cv::cudev::HSV4_to_RGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffad45b6fe24ba643e340fa0dfdf6286',1,'HSV4_to_RGB_()(Global Namespace)']]], - ['hsv4_5fto_5frgb_5ffull_5f_579',['HSV4_to_RGB_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae23caa3af3f3546a22499a7f98492a28',1,'cv::cudev::HSV4_to_RGB_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae23caa3af3f3546a22499a7f98492a28',1,'HSV4_to_RGB_FULL_()(Global Namespace)']]], - ['hsv4_5fto_5frgb_5ffull_5ffunc_580',['HSV4_to_RGB_FULL_func',['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1cudev_1_1HSV4__to__RGB__FULL__func.html',1,'cv::cudev']]], - ['hsv4_5fto_5frgb_5ffull_5ffunc_3c_20float_20_3e_581',['HSV4_to_RGB_FULL_func< float >',['https://docs.opencv.org/4.2.0/dd/d6b/structcv_1_1cudev_1_1HSV4__to__RGB__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv4_5fto_5frgb_5ffunc_582',['HSV4_to_RGB_func',['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1HSV4__to__RGB__func.html',1,'cv::cudev']]], - ['hsv4_5fto_5frgb_5ffunc_3c_20float_20_3e_583',['HSV4_to_RGB_func< float >',['https://docs.opencv.org/4.2.0/d1/d95/structcv_1_1cudev_1_1HSV4__to__RGB__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv4_5fto_5frgba_5f_584',['HSV4_to_RGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf17e206202c7f1b7276f23160ea2570b',1,'cv::cudev::HSV4_to_RGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf17e206202c7f1b7276f23160ea2570b',1,'HSV4_to_RGBA_()(Global Namespace)']]], - ['hsv4_5fto_5frgba_5ffull_5f_585',['HSV4_to_RGBA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3ced2be51a3939259d1ac1e346d39eb',1,'cv::cudev::HSV4_to_RGBA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3ced2be51a3939259d1ac1e346d39eb',1,'HSV4_to_RGBA_FULL_()(Global Namespace)']]], - ['hsv4_5fto_5frgba_5ffull_5ffunc_586',['HSV4_to_RGBA_FULL_func',['https://docs.opencv.org/4.2.0/d7/d30/structcv_1_1cudev_1_1HSV4__to__RGBA__FULL__func.html',1,'cv::cudev']]], - ['hsv4_5fto_5frgba_5ffull_5ffunc_3c_20float_20_3e_587',['HSV4_to_RGBA_FULL_func< float >',['https://docs.opencv.org/4.2.0/df/d03/structcv_1_1cudev_1_1HSV4__to__RGBA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv4_5fto_5frgba_5ffunc_588',['HSV4_to_RGBA_func',['https://docs.opencv.org/4.2.0/d5/dea/structcv_1_1cudev_1_1HSV4__to__RGBA__func.html',1,'cv::cudev']]], - ['hsv4_5fto_5frgba_5ffunc_3c_20float_20_3e_589',['HSV4_to_RGBA_func< float >',['https://docs.opencv.org/4.2.0/d7/d18/structcv_1_1cudev_1_1HSV4__to__RGBA__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv_5fto_5fbgr_5f_590',['HSV_to_BGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82b218484b6caf2656b989f5e9fef676',1,'cv::cudev::HSV_to_BGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82b218484b6caf2656b989f5e9fef676',1,'HSV_to_BGR_()(Global Namespace)']]], - ['hsv_5fto_5fbgr_5ffull_5f_591',['HSV_to_BGR_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ce1c4c00131922871824f973f8dab24',1,'cv::cudev::HSV_to_BGR_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ce1c4c00131922871824f973f8dab24',1,'HSV_to_BGR_FULL_()(Global Namespace)']]], - ['hsv_5fto_5fbgr_5ffull_5ffunc_592',['HSV_to_BGR_FULL_func',['https://docs.opencv.org/4.2.0/d0/da4/structcv_1_1cudev_1_1HSV__to__BGR__FULL__func.html',1,'cv::cudev']]], - ['hsv_5fto_5fbgr_5ffull_5ffunc_3c_20float_20_3e_593',['HSV_to_BGR_FULL_func< float >',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1cudev_1_1HSV__to__BGR__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv_5fto_5fbgr_5ffunc_594',['HSV_to_BGR_func',['https://docs.opencv.org/4.2.0/d9/d4c/structcv_1_1cudev_1_1HSV__to__BGR__func.html',1,'cv::cudev']]], - ['hsv_5fto_5fbgr_5ffunc_3c_20float_20_3e_595',['HSV_to_BGR_func< float >',['https://docs.opencv.org/4.2.0/df/dd5/structcv_1_1cudev_1_1HSV__to__BGR__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv_5fto_5fbgra_5f_596',['HSV_to_BGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd639c9f834a5b48797c3a4cb42d3c4',1,'cv::cudev::HSV_to_BGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd639c9f834a5b48797c3a4cb42d3c4',1,'HSV_to_BGRA_()(Global Namespace)']]], - ['hsv_5fto_5fbgra_5ffull_5f_597',['HSV_to_BGRA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d0f07bfc5d937b9712c3badaaaac75a',1,'cv::cudev::HSV_to_BGRA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d0f07bfc5d937b9712c3badaaaac75a',1,'HSV_to_BGRA_FULL_()(Global Namespace)']]], - ['hsv_5fto_5fbgra_5ffull_5ffunc_598',['HSV_to_BGRA_FULL_func',['https://docs.opencv.org/4.2.0/dc/d25/structcv_1_1cudev_1_1HSV__to__BGRA__FULL__func.html',1,'cv::cudev']]], - ['hsv_5fto_5fbgra_5ffull_5ffunc_3c_20float_20_3e_599',['HSV_to_BGRA_FULL_func< float >',['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1HSV__to__BGRA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv_5fto_5fbgra_5ffunc_600',['HSV_to_BGRA_func',['https://docs.opencv.org/4.2.0/d2/d8f/structcv_1_1cudev_1_1HSV__to__BGRA__func.html',1,'cv::cudev']]], - ['hsv_5fto_5fbgra_5ffunc_3c_20float_20_3e_601',['HSV_to_BGRA_func< float >',['https://docs.opencv.org/4.2.0/d3/db4/structcv_1_1cudev_1_1HSV__to__BGRA__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv_5fto_5frgb_5f_602',['HSV_to_RGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43b8acc36d3be756174c8a7da2658497',1,'cv::cudev::HSV_to_RGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43b8acc36d3be756174c8a7da2658497',1,'HSV_to_RGB_()(Global Namespace)']]], - ['hsv_5fto_5frgb_5ffull_5f_603',['HSV_to_RGB_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fba245bdd2a25b2c8c5b73fc22a9cce',1,'cv::cudev::HSV_to_RGB_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fba245bdd2a25b2c8c5b73fc22a9cce',1,'HSV_to_RGB_FULL_()(Global Namespace)']]], - ['hsv_5fto_5frgb_5ffull_5ffunc_604',['HSV_to_RGB_FULL_func',['https://docs.opencv.org/4.2.0/d7/d86/structcv_1_1cudev_1_1HSV__to__RGB__FULL__func.html',1,'cv::cudev']]], - ['hsv_5fto_5frgb_5ffull_5ffunc_3c_20float_20_3e_605',['HSV_to_RGB_FULL_func< float >',['https://docs.opencv.org/4.2.0/dc/d25/structcv_1_1cudev_1_1HSV__to__RGB__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv_5fto_5frgb_5ffunc_606',['HSV_to_RGB_func',['https://docs.opencv.org/4.2.0/d8/d1e/structcv_1_1cudev_1_1HSV__to__RGB__func.html',1,'cv::cudev']]], - ['hsv_5fto_5frgb_5ffunc_3c_20float_20_3e_607',['HSV_to_RGB_func< float >',['https://docs.opencv.org/4.2.0/d2/d73/structcv_1_1cudev_1_1HSV__to__RGB__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv_5fto_5frgba_5f_608',['HSV_to_RGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad42efde80cb6059da6517070b631a18f',1,'cv::cudev::HSV_to_RGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad42efde80cb6059da6517070b631a18f',1,'HSV_to_RGBA_()(Global Namespace)']]], - ['hsv_5fto_5frgba_5ffull_5f_609',['HSV_to_RGBA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f6dceaee6cca4db97ef093899def638',1,'cv::cudev::HSV_to_RGBA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f6dceaee6cca4db97ef093899def638',1,'HSV_to_RGBA_FULL_()(Global Namespace)']]], - ['hsv_5fto_5frgba_5ffull_5ffunc_610',['HSV_to_RGBA_FULL_func',['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1HSV__to__RGBA__FULL__func.html',1,'cv::cudev']]], - ['hsv_5fto_5frgba_5ffull_5ffunc_3c_20float_20_3e_611',['HSV_to_RGBA_FULL_func< float >',['https://docs.opencv.org/4.2.0/de/dda/structcv_1_1cudev_1_1HSV__to__RGBA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hsv_5fto_5frgba_5ffunc_612',['HSV_to_RGBA_func',['https://docs.opencv.org/4.2.0/df/d10/structcv_1_1cudev_1_1HSV__to__RGBA__func.html',1,'cv::cudev']]], - ['hsv_5fto_5frgba_5ffunc_3c_20float_20_3e_613',['HSV_to_RGBA_func< float >',['https://docs.opencv.org/4.2.0/d8/dff/structcv_1_1cudev_1_1HSV__to__RGBA__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hugecost_614',['HugeCost',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a3163430a1c13173faffde69016b48aaf',1,'Eigen']]], - ['hull_615',['Convex Hull',['https://docs.opencv.org/4.2.0/d7/d1d/tutorial_hull.html',1,'']]], - ['hull_2emarkdown_616',['hull.markdown',['https://docs.opencv.org/4.2.0/d0/dbd/hull_8markdown.html',1,'']]], - ['human_20pose_20estimation_617',['Human Pose Estimation',['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html',1,'']]], - ['human_20retina_20and_20its_20use_20for_20image_20processing_618',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], - ['humaneva_5f1_619',['humaneva_1',['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html#gga570cd866657e421a9d34fd891214cdaca58a323dca9edfd3fa43b0c2a90218743',1,'cv::datasets::humaneva_1'],['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html#gga570cd866657e421a9d34fd891214cdaca58a323dca9edfd3fa43b0c2a90218743',1,'humaneva_1(Global Namespace)']]], - ['humaneva_5f2_620',['humaneva_2',['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html#gga570cd866657e421a9d34fd891214cdaca367d42dd71351d8c381ddad686308f0e',1,'cv::datasets::humaneva_2'],['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html#gga570cd866657e421a9d34fd891214cdaca367d42dd71351d8c381ddad686308f0e',1,'humaneva_2(Global Namespace)']]], - ['humanseg_621',['humanSeg',['https://docs.opencv.org/4.2.0/d8/d65/structcv_1_1datasets_1_1IS__weizmannObj.html#a657b127a842bb3ab4bf9a496cf0cf208',1,'cv::datasets::IS_weizmannObj']]], - ['humoments_622',['HuMoments',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gab001db45c1f1af6cbdbe64df04c4e944',1,'cv::HuMoments(const Moments &moments, double hu[7])'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga6d6ac1b519cba25190119afe3a52c1cc',1,'cv::HuMoments(const Moments &m, OutputArray hu)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gab001db45c1f1af6cbdbe64df04c4e944',1,'HuMoments(const Moments &moments, double hu[7])(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga6d6ac1b519cba25190119afe3a52c1cc',1,'HuMoments(const Moments &m, OutputArray hu)(Global Namespace)']]], - ['hyperg_623',['hyperg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#af52cf49736c63b0bb000be98b53c221f',1,'__gnu_cxx::hyperg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01550.html#af320db7639ced3d53b1b86cf8f2aaa3f',1,'std::tr1::hyperg()']]], - ['hypergf_624',['hypergf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ac4c81e4ea9cef149fe40291ca10d7e15',1,'__gnu_cxx']]], - ['hypergl_625',['hypergl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a9961967087216e97f76283f29e1be152',1,'__gnu_cxx']]], - ['hyperplane_626',['Hyperplane',['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html',1,'Eigen::Hyperplane< class, _AmbientDim, _Options >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#aa19ee87ada63fa6576bf61517424b1b3',1,'Eigen::Hyperplane::Hyperplane()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ae03c337cae9fd43396f92b9e97e600b1',1,'Eigen::Hyperplane::Hyperplane(const Hyperplane< OtherScalarType, AmbientDimAtCompileTime, OtherOptions > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ad05d941675fd03b46dd1029f2f0c95ea',1,'Eigen::Hyperplane::Hyperplane(const ParametrizedLine< Scalar, AmbientDimAtCompileTime > &parametrized)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a76a1ed93c5f7e3a9aba4f029809d6ebc',1,'Eigen::Hyperplane::Hyperplane(const VectorType &n, const Scalar &d)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a0f9ca82a2cf12753da3a007e128631f8',1,'Eigen::Hyperplane::Hyperplane(const VectorType &n, const VectorType &e)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a75aebf8b553ea33a193ea94583a7f830',1,'Eigen::Hyperplane::Hyperplane(Index _dim)']]], - ['hypot_627',['hypot',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3de325d007af83e37038f276f0075f37',1,'cv::cudev::hypot(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d19807d7720955e8c60a1360488391',1,'cv::cudev::hypot(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2837133d9a05258561700df5a26880df',1,'cv::cudev::hypot(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5476184a23c83d1017b3921339744e86',1,'cv::cudev::hypot(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ab6c2da2a5ebff78676dc96cb3c8b53',1,'cv::cudev::hypot(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9a708875710084583930f8a4d49cadd',1,'cv::cudev::hypot(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b765c0093d928f09a219c0c95b46dc3',1,'cv::cudev::hypot(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46ed1fd750b263ea43a69347ddee79c9',1,'cv::cudev::hypot(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46d5a3623693c46012581ca6ddc0795b',1,'cv::cudev::hypot(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab03f9453516a83f67ba4c198d5fc2273',1,'cv::cudev::hypot(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5777fbbe63ab5bd4e84df3453adf2834',1,'cv::cudev::hypot(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad122ad9cf51fa3979c5ebd34861f48',1,'cv::cudev::hypot(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5052b8704ce8cf93c419b8921c89716a',1,'cv::cudev::hypot(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88d038ec76d27f2d913476d07190b159',1,'cv::cudev::hypot(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d1b87445f03882e446ea21a8b6b5189',1,'cv::cudev::hypot(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadf8d879a9b9f7a1f204488708081c29',1,'cv::cudev::hypot(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f457b58ca512c0a9bff8579bc704c76',1,'cv::cudev::hypot(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2284f04e5c0378bcdbe6216bfdc11f52',1,'cv::cudev::hypot(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56baedaf61f69acae5f872a08bd0281d',1,'cv::cudev::hypot(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69d6dae9232bfde87bb3c28b11a885b7',1,'cv::cudev::hypot(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0b8935d90a412555caf3aac471815f1',1,'cv::cudev::hypot(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb921b67e516784306f9a1e699370ab7',1,'cv::cudev::hypot(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85fd6b44a40a4f5fa2feb9b91e4c8a58',1,'cv::cudev::hypot(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a4223dec414b3abdf6d1cc49f3af665',1,'cv::cudev::hypot(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bf8ea2b595c1c6b942f68ab05ce8aeb',1,'cv::cudev::hypot(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a4395a965a7c45e3ac5ec122e1a9f54',1,'cv::cudev::hypot(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7448a501833b6ac74cfea12506aa8a6',1,'cv::cudev::hypot(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ef9edbbd62500592e33808a8da79e1e',1,'cv::cudev::hypot(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84f32d88196f39f79c5e9acba5c5b756',1,'cv::cudev::hypot(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf686dc7b270524f0e89f574c4fd27a30',1,'cv::cudev::hypot(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga295499364626876c090b970f532db885',1,'cv::cudev::hypot(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa062be7da49aa532bceb7be29abe584e',1,'cv::cudev::hypot(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65d7e0aa99f5bad1d52a75367ac15aea',1,'cv::cudev::hypot(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c917fef38a465fca73545eb52dc3794',1,'cv::cudev::hypot(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa505d8a5c7d4b16e2feb6feb030aad70',1,'cv::cudev::hypot(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacee2aa0efc09ab3a73e1bb59efb61fa7',1,'cv::cudev::hypot(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdee1be11e9c9623c520cc7f68189d82',1,'cv::cudev::hypot(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga940a210370a35ecb4b5eb093360a8573',1,'cv::cudev::hypot(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cfb49232d9de5ac9acc8344d6296ea1',1,'cv::cudev::hypot(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga846563089a662b104d61bb35a798b1ca',1,'cv::cudev::hypot(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2931f849ca79d74332e3194f58a06a01',1,'cv::cudev::hypot(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02f072b2a8361fc13a837fd54830842f',1,'cv::cudev::hypot(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d6c2e8723743e7b4f13d0d1c621a197',1,'cv::cudev::hypot(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21bd4bfb94fb00ca9b5cd7c88214ba70',1,'cv::cudev::hypot(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ea0c820b99f5fe7a5b87581059db7a9',1,'cv::cudev::hypot(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9698a3d8d27dd3f6eda99a8023bf609e',1,'cv::cudev::hypot(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9c95e4921bbed34fa035f59b03c8711',1,'cv::cudev::hypot(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga254699c5e81c6be8ded978ae66370649',1,'cv::cudev::hypot(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08ee789e2698654a1e6dbdccac0ef2c8',1,'cv::cudev::hypot(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa51bef4fe848cf683993d7399715ca24',1,'cv::cudev::hypot(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga417c566a65ab5092a705e61ee7b0c5f0',1,'cv::cudev::hypot(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf692ac6d3707e0e37ef26ffbd3787361',1,'cv::cudev::hypot(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5342f304a59e8de44a2ecad14fd7c287',1,'cv::cudev::hypot(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81dd4a1ecf60637d8027ed38e767ee05',1,'cv::cudev::hypot(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4abdd0d7c4929b85e1d0e3062a19499',1,'cv::cudev::hypot(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac04c9c20834dbf76468bdd0d729099fc',1,'cv::cudev::hypot(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3661cadd91faeaf1eb02b005f11106f',1,'cv::cudev::hypot(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaec0a8578e690cfeff325e719ca5909c',1,'cv::cudev::hypot(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0815869e7df0dee8926e66337f98232b',1,'cv::cudev::hypot(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fb153dd56576e2e29b24560fda78342',1,'cv::cudev::hypot(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f3f6388cc78ce256de7fb8dd9990b92',1,'cv::cudev::hypot(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3455b906ce3ac0b957743a7d1b2d1d2',1,'cv::cudev::hypot(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e341002f3c5c1cd0a394cb66d0565c8',1,'cv::cudev::hypot(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a741ac32cc37fb7522c602fb01d71cd',1,'cv::cudev::hypot(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga514230ee6c217ca3ba495898ee4b1eb9',1,'cv::cudev::hypot(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3cbe3347aebcc8fcb84bc9ca44dd260',1,'cv::cudev::hypot(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e134ce1665a1b7d247548443e637ba',1,'cv::cudev::hypot(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ffcd3b9d022ae9fbccf2763ebb21e3d',1,'cv::cudev::hypot(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac9ead9fd9c082cc0901012f62f6e88b',1,'cv::cudev::hypot(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d63c7947467900bc9496393e9a5e07a',1,'cv::cudev::hypot(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9d3281b1cf6200a2e43cb4e3e9d31e4',1,'cv::cudev::hypot(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42bb87274411e6cdba942a8cae45d4ce',1,'cv::cudev::hypot(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb3a415a3ec64853422327dd38a41796',1,'cv::cudev::hypot(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga951ece2f9524c9c5c78e465c984fe9ca',1,'cv::cudev::hypot(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf86a282592a40893744b84f17afdec6c',1,'cv::cudev::hypot(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d0cbb20d17cd126fe25d6724cdfd21',1,'cv::cudev::hypot(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe98a9a4191c164d0dc0c6a13b0ac6f8',1,'cv::cudev::hypot(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5e604f4e2308d2c01d6d1e127131058',1,'cv::cudev::hypot(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98f7f2efa4e9385ffcd471648a34e2db',1,'cv::cudev::hypot(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad05339f8c1b091f6e0b2699011cd0063',1,'cv::cudev::hypot(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae961d6c5f5a09edaea1e28f8bff135a9',1,'cv::cudev::hypot(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac266b9ef346b1ea9f5176cec6b77ac1a',1,'cv::cudev::hypot(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga940fb7de42319c5cb16f374f8838ab80',1,'cv::cudev::hypot(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae52ad07ad9e7d6df604b7590fb88fb0c',1,'cv::cudev::hypot(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5477ba938004737b396f23a2994c0e41',1,'cv::cudev::hypot(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab42a1d1d7877273cc748f441eef18da',1,'cv::cudev::hypot(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa23b3b8964333c6eeff3cf318e002c70',1,'cv::cudev::hypot(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d4067058bb20a44e729d9fd1787f65',1,'cv::cudev::hypot(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5b28ba05711baaad9cad7f5db2b657',1,'cv::cudev::hypot(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac85d50f6f5642687737f6aead2c2d0c7',1,'cv::cudev::hypot(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf798393fa860625a567389b68fb2e07',1,'cv::cudev::hypot(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6df029f27ddbba98d2b84d5f960b6b71',1,'cv::cudev::hypot(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfa1e048923646d7d18ebc7e5c6ff093',1,'cv::cudev::hypot(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e465937603ed228606cb2c541240d03',1,'cv::cudev::hypot(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa269982371abff271f7cd3236f83238a',1,'cv::cudev::hypot(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa614ce5ee397fb0016e6c26e98c99818',1,'cv::cudev::hypot(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70f8662b9abf3d77cd9e98c93b8eea34',1,'cv::cudev::hypot(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a638cd87ed01357d41c28c83a927d59',1,'cv::cudev::hypot(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d0b42426aa05b9a400212b2ea5c27cb',1,'cv::cudev::hypot(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b17d81fb2ab2c5685e0e4344e014e90',1,'cv::cudev::hypot(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f3920922dec566e697f844deab6efc',1,'cv::cudev::hypot(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7d1f369bbf04f37426975fa26dd3d39',1,'cv::cudev::hypot(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2640f7b24bd4c5ce16d9032da9f841b4',1,'cv::cudev::hypot(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab84aedaf5c87ca9aa11e55a0927849c',1,'cv::cudev::hypot(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80d0c0c307bc97eb5ad48977ca84b825',1,'cv::cudev::hypot(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3bde2ac36f65591eead2749f7a1c48e',1,'cv::cudev::hypot(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga762fc3af5da6ac3b2dc7184e04fe7db8',1,'cv::cudev::hypot(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3cd6e2c5464c5b81d179c594eeb1d629',1,'cv::cudev::hypot(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f8d3813add59b6373ed4c4a3c9ebd6',1,'cv::cudev::hypot(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff42a3082380dbde708ed030fdf926e',1,'cv::cudev::hypot(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad993a6a07164cce632d0718468556815',1,'cv::cudev::hypot(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae62108221a9c33cfef28c1b8c35f7ded',1,'cv::cudev::hypot(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa66765aef1a6b96797a6b2c6794d1e23',1,'cv::cudev::hypot(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga065b045f306d1d0734814646a0e5ac86',1,'cv::cudev::hypot(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9625895633014827d120c19b56a0fa69',1,'cv::cudev::hypot(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d3263772a7c0cb57d4d10c9ab6a0e19',1,'cv::cudev::hypot(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac982534b2123826b736f0959de52cbe2',1,'cv::cudev::hypot(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga809de16c6e2c5223c24267ccf2512a99',1,'cv::cudev::hypot(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga011392527ff73805d16269b8417e1771',1,'cv::cudev::hypot(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga962bb96ce3d106dc7afdaeaef9499b8b',1,'cv::cudev::hypot(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ab9da1f27485f833c0c0afce93907d2',1,'cv::cudev::hypot(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga293ab0f46540f4becd49692358114c0e',1,'cv::cudev::hypot(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5118fa415bd8914cdb981aae79c2a0b2',1,'cv::cudev::hypot(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00b1ebd70b412a665918c5266f5ec09d',1,'cv::cudev::hypot(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e73831dadab469aa47ed24fa174b9cd',1,'cv::cudev::hypot(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f3e69ae032d99664631892884f3f55a',1,'cv::cudev::hypot(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c22ee105e405c46e5e7acbdb77d72f7',1,'cv::cudev::hypot(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60c8df5704ce0f85f62e4479cf06d031',1,'cv::cudev::hypot(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5485aa3b7f159b5acba4efbc4392383c',1,'cv::cudev::hypot(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba960bca3a54e7dd3621eebc646af3d7',1,'cv::cudev::hypot(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ee9559ae09429b769888252bfbfe4ab',1,'cv::cudev::hypot(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5480779c7f1a0e7f5e9d2d7b4d089a76',1,'cv::cudev::hypot(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5dbecfe0734bade368f93f6da10649aa',1,'cv::cudev::hypot(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a61ebafdaff685afb93927a6e324788',1,'cv::cudev::hypot(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08b8090712b081338c8f61bc6faff114',1,'cv::cudev::hypot(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab443983069f8d009392505898853d19e',1,'cv::cudev::hypot(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc0a537253f3b8e2a9c4442e47abdcc',1,'cv::cudev::hypot(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c1eb238c64b78b9569d5f647843a4f5',1,'cv::cudev::hypot(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bbe8d2395e710658c1dbafbc1a17980',1,'cv::cudev::hypot(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacbaf22ad8cbb046ab3a096504f415d55',1,'cv::cudev::hypot(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b6147ad368eee4533098d0961621789',1,'cv::cudev::hypot(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga003fe1965f549f6ebe4ceb27e9a7782a',1,'cv::cudev::hypot(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80e633d6154d43204c37b7d243c7808a',1,'cv::cudev::hypot(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa84447ffe361b8896577711fed43ea29',1,'cv::cudev::hypot(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga261cd4cd5ab353536e09b84803c64cc0',1,'cv::cudev::hypot(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24e0a3ca9046296a6017b484a409a22a',1,'cv::cudev::hypot(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d538f7eb05fdeab85fa59f73f909b40',1,'cv::cudev::hypot(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be0d88867e3629d17ed7d709bda3151',1,'cv::cudev::hypot(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36f1096e7b4db4cb7fc14abf31a7dc4f',1,'cv::cudev::hypot(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae752017a11bc8039a4ee8113e5adb70c',1,'cv::cudev::hypot(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8506e061868a9d0b56860b966f119dad',1,'cv::cudev::hypot(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f4936864a32235503000102f5e0cb8f',1,'cv::cudev::hypot(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3de325d007af83e37038f276f0075f37',1,'hypot(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d19807d7720955e8c60a1360488391',1,'hypot(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2837133d9a05258561700df5a26880df',1,'hypot(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5476184a23c83d1017b3921339744e86',1,'hypot(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ab6c2da2a5ebff78676dc96cb3c8b53',1,'hypot(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9a708875710084583930f8a4d49cadd',1,'hypot(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b765c0093d928f09a219c0c95b46dc3',1,'hypot(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46ed1fd750b263ea43a69347ddee79c9',1,'hypot(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46d5a3623693c46012581ca6ddc0795b',1,'hypot(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab03f9453516a83f67ba4c198d5fc2273',1,'hypot(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5777fbbe63ab5bd4e84df3453adf2834',1,'hypot(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad122ad9cf51fa3979c5ebd34861f48',1,'hypot(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5052b8704ce8cf93c419b8921c89716a',1,'hypot(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88d038ec76d27f2d913476d07190b159',1,'hypot(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d1b87445f03882e446ea21a8b6b5189',1,'hypot(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadf8d879a9b9f7a1f204488708081c29',1,'hypot(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f457b58ca512c0a9bff8579bc704c76',1,'hypot(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2284f04e5c0378bcdbe6216bfdc11f52',1,'hypot(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56baedaf61f69acae5f872a08bd0281d',1,'hypot(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69d6dae9232bfde87bb3c28b11a885b7',1,'hypot(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0b8935d90a412555caf3aac471815f1',1,'hypot(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb921b67e516784306f9a1e699370ab7',1,'hypot(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85fd6b44a40a4f5fa2feb9b91e4c8a58',1,'hypot(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a4223dec414b3abdf6d1cc49f3af665',1,'hypot(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bf8ea2b595c1c6b942f68ab05ce8aeb',1,'hypot(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a4395a965a7c45e3ac5ec122e1a9f54',1,'hypot(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7448a501833b6ac74cfea12506aa8a6',1,'hypot(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ef9edbbd62500592e33808a8da79e1e',1,'hypot(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84f32d88196f39f79c5e9acba5c5b756',1,'hypot(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf686dc7b270524f0e89f574c4fd27a30',1,'hypot(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga295499364626876c090b970f532db885',1,'hypot(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa062be7da49aa532bceb7be29abe584e',1,'hypot(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65d7e0aa99f5bad1d52a75367ac15aea',1,'hypot(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c917fef38a465fca73545eb52dc3794',1,'hypot(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa505d8a5c7d4b16e2feb6feb030aad70',1,'hypot(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacee2aa0efc09ab3a73e1bb59efb61fa7',1,'hypot(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdee1be11e9c9623c520cc7f68189d82',1,'hypot(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga940a210370a35ecb4b5eb093360a8573',1,'hypot(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cfb49232d9de5ac9acc8344d6296ea1',1,'hypot(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga846563089a662b104d61bb35a798b1ca',1,'hypot(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2931f849ca79d74332e3194f58a06a01',1,'hypot(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02f072b2a8361fc13a837fd54830842f',1,'hypot(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d6c2e8723743e7b4f13d0d1c621a197',1,'hypot(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21bd4bfb94fb00ca9b5cd7c88214ba70',1,'hypot(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ea0c820b99f5fe7a5b87581059db7a9',1,'hypot(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9698a3d8d27dd3f6eda99a8023bf609e',1,'hypot(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9c95e4921bbed34fa035f59b03c8711',1,'hypot(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga254699c5e81c6be8ded978ae66370649',1,'hypot(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08ee789e2698654a1e6dbdccac0ef2c8',1,'hypot(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa51bef4fe848cf683993d7399715ca24',1,'hypot(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga417c566a65ab5092a705e61ee7b0c5f0',1,'hypot(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf692ac6d3707e0e37ef26ffbd3787361',1,'hypot(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5342f304a59e8de44a2ecad14fd7c287',1,'hypot(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81dd4a1ecf60637d8027ed38e767ee05',1,'hypot(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4abdd0d7c4929b85e1d0e3062a19499',1,'hypot(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac04c9c20834dbf76468bdd0d729099fc',1,'hypot(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3661cadd91faeaf1eb02b005f11106f',1,'hypot(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaec0a8578e690cfeff325e719ca5909c',1,'hypot(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0815869e7df0dee8926e66337f98232b',1,'hypot(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fb153dd56576e2e29b24560fda78342',1,'hypot(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f3f6388cc78ce256de7fb8dd9990b92',1,'hypot(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3455b906ce3ac0b957743a7d1b2d1d2',1,'hypot(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e341002f3c5c1cd0a394cb66d0565c8',1,'hypot(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a741ac32cc37fb7522c602fb01d71cd',1,'hypot(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga514230ee6c217ca3ba495898ee4b1eb9',1,'hypot(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3cbe3347aebcc8fcb84bc9ca44dd260',1,'hypot(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e134ce1665a1b7d247548443e637ba',1,'hypot(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ffcd3b9d022ae9fbccf2763ebb21e3d',1,'hypot(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac9ead9fd9c082cc0901012f62f6e88b',1,'hypot(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d63c7947467900bc9496393e9a5e07a',1,'hypot(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9d3281b1cf6200a2e43cb4e3e9d31e4',1,'hypot(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42bb87274411e6cdba942a8cae45d4ce',1,'hypot(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb3a415a3ec64853422327dd38a41796',1,'hypot(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga951ece2f9524c9c5c78e465c984fe9ca',1,'hypot(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf86a282592a40893744b84f17afdec6c',1,'hypot(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d0cbb20d17cd126fe25d6724cdfd21',1,'hypot(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe98a9a4191c164d0dc0c6a13b0ac6f8',1,'hypot(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5e604f4e2308d2c01d6d1e127131058',1,'hypot(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98f7f2efa4e9385ffcd471648a34e2db',1,'hypot(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad05339f8c1b091f6e0b2699011cd0063',1,'hypot(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae961d6c5f5a09edaea1e28f8bff135a9',1,'hypot(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac266b9ef346b1ea9f5176cec6b77ac1a',1,'hypot(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga940fb7de42319c5cb16f374f8838ab80',1,'hypot(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae52ad07ad9e7d6df604b7590fb88fb0c',1,'hypot(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5477ba938004737b396f23a2994c0e41',1,'hypot(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab42a1d1d7877273cc748f441eef18da',1,'hypot(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa23b3b8964333c6eeff3cf318e002c70',1,'hypot(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d4067058bb20a44e729d9fd1787f65',1,'hypot(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5b28ba05711baaad9cad7f5db2b657',1,'hypot(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac85d50f6f5642687737f6aead2c2d0c7',1,'hypot(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf798393fa860625a567389b68fb2e07',1,'hypot(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6df029f27ddbba98d2b84d5f960b6b71',1,'hypot(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfa1e048923646d7d18ebc7e5c6ff093',1,'hypot(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e465937603ed228606cb2c541240d03',1,'hypot(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa269982371abff271f7cd3236f83238a',1,'hypot(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa614ce5ee397fb0016e6c26e98c99818',1,'hypot(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70f8662b9abf3d77cd9e98c93b8eea34',1,'hypot(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a638cd87ed01357d41c28c83a927d59',1,'hypot(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d0b42426aa05b9a400212b2ea5c27cb',1,'hypot(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b17d81fb2ab2c5685e0e4344e014e90',1,'hypot(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f3920922dec566e697f844deab6efc',1,'hypot(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7d1f369bbf04f37426975fa26dd3d39',1,'hypot(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2640f7b24bd4c5ce16d9032da9f841b4',1,'hypot(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab84aedaf5c87ca9aa11e55a0927849c',1,'hypot(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80d0c0c307bc97eb5ad48977ca84b825',1,'hypot(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3bde2ac36f65591eead2749f7a1c48e',1,'hypot(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga762fc3af5da6ac3b2dc7184e04fe7db8',1,'hypot(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3cd6e2c5464c5b81d179c594eeb1d629',1,'hypot(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f8d3813add59b6373ed4c4a3c9ebd6',1,'hypot(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff42a3082380dbde708ed030fdf926e',1,'hypot(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad993a6a07164cce632d0718468556815',1,'hypot(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae62108221a9c33cfef28c1b8c35f7ded',1,'hypot(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa66765aef1a6b96797a6b2c6794d1e23',1,'hypot(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga065b045f306d1d0734814646a0e5ac86',1,'hypot(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9625895633014827d120c19b56a0fa69',1,'hypot(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d3263772a7c0cb57d4d10c9ab6a0e19',1,'hypot(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac982534b2123826b736f0959de52cbe2',1,'hypot(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga809de16c6e2c5223c24267ccf2512a99',1,'hypot(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga011392527ff73805d16269b8417e1771',1,'hypot(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga962bb96ce3d106dc7afdaeaef9499b8b',1,'hypot(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ab9da1f27485f833c0c0afce93907d2',1,'hypot(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga293ab0f46540f4becd49692358114c0e',1,'hypot(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5118fa415bd8914cdb981aae79c2a0b2',1,'hypot(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00b1ebd70b412a665918c5266f5ec09d',1,'hypot(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e73831dadab469aa47ed24fa174b9cd',1,'hypot(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f3e69ae032d99664631892884f3f55a',1,'hypot(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c22ee105e405c46e5e7acbdb77d72f7',1,'hypot(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60c8df5704ce0f85f62e4479cf06d031',1,'hypot(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5485aa3b7f159b5acba4efbc4392383c',1,'hypot(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba960bca3a54e7dd3621eebc646af3d7',1,'hypot(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ee9559ae09429b769888252bfbfe4ab',1,'hypot(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5480779c7f1a0e7f5e9d2d7b4d089a76',1,'hypot(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5dbecfe0734bade368f93f6da10649aa',1,'hypot(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a61ebafdaff685afb93927a6e324788',1,'hypot(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08b8090712b081338c8f61bc6faff114',1,'hypot(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab443983069f8d009392505898853d19e',1,'hypot(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc0a537253f3b8e2a9c4442e47abdcc',1,'hypot(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c1eb238c64b78b9569d5f647843a4f5',1,'hypot(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bbe8d2395e710658c1dbafbc1a17980',1,'hypot(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacbaf22ad8cbb046ab3a096504f415d55',1,'hypot(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b6147ad368eee4533098d0961621789',1,'hypot(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga003fe1965f549f6ebe4ceb27e9a7782a',1,'hypot(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80e633d6154d43204c37b7d243c7808a',1,'hypot(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa84447ffe361b8896577711fed43ea29',1,'hypot(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga261cd4cd5ab353536e09b84803c64cc0',1,'hypot(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24e0a3ca9046296a6017b484a409a22a',1,'hypot(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d538f7eb05fdeab85fa59f73f909b40',1,'hypot(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be0d88867e3629d17ed7d709bda3151',1,'hypot(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36f1096e7b4db4cb7fc14abf31a7dc4f',1,'hypot(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae752017a11bc8039a4ee8113e5adb70c',1,'hypot(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8506e061868a9d0b56860b966f119dad',1,'hypot(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f4936864a32235503000102f5e0cb8f',1,'hypot(double s, const double2 &b)(Global Namespace)']]], - ['hypot_5f_628',['hypot_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5667712d8036c43591f7abe1e2b219d0',1,'cv::cudev::hypot_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5667712d8036c43591f7abe1e2b219d0',1,'hypot_()(Global Namespace)']]], - ['hypot_5ffunc_629',['hypot_func',['https://docs.opencv.org/4.2.0/d9/d3e/structcv_1_1cudev_1_1hypot__func.html',1,'cv::cudev']]], - ['hypot_5ffunc_3c_20double_20_3e_630',['hypot_func< double >',['https://docs.opencv.org/4.2.0/d6/d05/structcv_1_1cudev_1_1hypot__func_3_01double_01_4.html',1,'cv::cudev']]], - ['hypot_5ffunc_3c_20float_20_3e_631',['hypot_func< float >',['https://docs.opencv.org/4.2.0/d4/d37/structcv_1_1cudev_1_1hypot__func_3_01float_01_4.html',1,'cv::cudev']]], - ['hypot_5ffunc_3c_20schar_20_3e_632',['hypot_func< schar >',['https://docs.opencv.org/4.2.0/df/dbd/structcv_1_1cudev_1_1hypot__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['hypot_5ffunc_3c_20short_20_3e_633',['hypot_func< short >',['https://docs.opencv.org/4.2.0/dd/d0b/structcv_1_1cudev_1_1hypot__func_3_01short_01_4.html',1,'cv::cudev']]], - ['hypot_5ffunc_3c_20uchar_20_3e_634',['hypot_func< uchar >',['https://docs.opencv.org/4.2.0/d2/db0/structcv_1_1cudev_1_1hypot__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['hypot_5ffunc_3c_20uint_20_3e_635',['hypot_func< uint >',['https://docs.opencv.org/4.2.0/d6/dad/structcv_1_1cudev_1_1hypot__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['hypot_5ffunc_3c_20ushort_20_3e_636',['hypot_func< ushort >',['https://docs.opencv.org/4.2.0/d7/d26/structcv_1_1cudev_1_1hypot__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['hypotnorm_637',['hypotNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a32222d3b6677e6cdf0b801463f329b72',1,'Eigen::MatrixBase::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a32222d3b6677e6cdf0b801463f329b72',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a32222d3b6677e6cdf0b801463f329b72',1,'MatrixBase< Solve< Decomposition, RhsType > >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'Eigen::VectorwiseOp::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const Derived, Horizontal >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const Derived, Vertical >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::hypotNorm()']]] + ['horizontal_509',['horizontal',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#ae7297d16cebc75ef79f227730c651cf1',1,'cv::structured_light::SinusoidalPattern::Params']]], + ['horizontal_20and_20vertical_20lines_20by_20using_20morphological_20operations_510',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], + ['horizontalcellsgain_511',['horizontalCellsGain',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#ab92fe32e98d0a84c0c444b26e7e3c143',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], + ['host_5fcopy_5fobsolete_512',['HOST_COPY_OBSOLETE',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12aa335180c2d069e30096f883702476f96',1,'cv::UMatData']]], + ['host_5ftype_513',['host_type',['https://docs.opencv.org/4.2.0/da/d1b/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GArray_3_01T_01_4_01_4.html#a52ae6fd216901e8a7d6fc33614886cca',1,'cv::detail::GTypeTraits< cv::GArray< T > >']]], + ['hostcopyobsolete_514',['hostCopyObsolete',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a52b9f7ef6e7b51fd9429d50bf115ad62',1,'cv::UMatData']]], + ['hostmem_515',['HostMem',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html',1,'cv::cuda::HostMem'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#abc1d3f04e0f38e97870a944f4cfb6852',1,'cv::cuda::HostMem::HostMem(HostMem::AllocType alloc_type=HostMem::AllocType::PAGE_LOCKED)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#abddf8d1a9db3b9369841e2bf40e4b210',1,'cv::cuda::HostMem::HostMem(const HostMem &m)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a2b306f27eed3a9acb34ca1142610c4e7',1,'cv::cuda::HostMem::HostMem(int rows, int cols, int type, HostMem::AllocType alloc_type=HostMem::AllocType::PAGE_LOCKED)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a768d8b14c2db875e6db4f3b8dc7bc884',1,'cv::cuda::HostMem::HostMem(Size size, int type, HostMem::AllocType alloc_type=HostMem::AllocType::PAGE_LOCKED)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ae750a078e64922f8d3fc81a8f1edbfb8',1,'cv::cuda::HostMem::HostMem(InputArray arr, HostMem::AllocType alloc_type=HostMem::AllocType::PAGE_LOCKED)']]], + ['hostunifiedmemory_516',['hostUnifiedMemory',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a95d6767205937a8c46258a23b993395c',1,'cv::ocl::Device']]], + ['hough_20circle_20transform_517',['Hough Circle Transform',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_hough_circle.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/da/d53/tutorial_py_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d3/de5/tutorial_js_houghcircles.html',1,'Hough Circle Transform']]], + ['hough_20line_20transform_518',['Hough Line Transform',['https://docs.opencv.org/4.2.0/d9/db0/tutorial_hough_lines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d6/d10/tutorial_py_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d3/de6/tutorial_js_houghlines.html',1,'Hough Line Transform']]], + ['hough_20transform_519',['Hough Transform',['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html',1,'']]], + ['hough_5fcircle_2emarkdown_520',['hough_circle.markdown',['https://docs.opencv.org/4.2.0/d4/d67/hough__circle_8markdown.html',1,'']]], + ['hough_5fgradient_521',['HOUGH_GRADIENT',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65ab1bf00a90864db34b2f72fa76389931d',1,'cv::HOUGH_GRADIENT'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65ab1bf00a90864db34b2f72fa76389931d',1,'HOUGH_GRADIENT(Global Namespace)']]], + ['hough_5flines_2emarkdown_522',['hough_lines.markdown',['https://docs.opencv.org/4.2.0/da/d5a/hough__lines_8markdown.html',1,'']]], + ['hough_5fmulti_5fscale_523',['HOUGH_MULTI_SCALE',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65a0f81016a60d190b6987386a0b4b478e4',1,'cv::HOUGH_MULTI_SCALE'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65a0f81016a60d190b6987386a0b4b478e4',1,'HOUGH_MULTI_SCALE(Global Namespace)']]], + ['hough_5fprobabilistic_524',['HOUGH_PROBABILISTIC',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65a2af8751122d7a6df8ef14dbc0799f76c',1,'cv::HOUGH_PROBABILISTIC'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65a2af8751122d7a6df8ef14dbc0799f76c',1,'HOUGH_PROBABILISTIC(Global Namespace)']]], + ['hough_5fstandard_525',['HOUGH_STANDARD',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65aeb97ba90cb7ffac9d55c71290aa258cc',1,'cv::HOUGH_STANDARD'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65aeb97ba90cb7ffac9d55c71290aa258cc',1,'HOUGH_STANDARD(Global Namespace)']]], + ['houghcircles_526',['HoughCircles',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga47849c3be0d0406ad3ca45db65a25d2d',1,'cv::HoughCircles()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga47849c3be0d0406ad3ca45db65a25d2d',1,'HoughCircles()(Global Namespace)']]], + ['houghcirclesdetector_527',['HoughCirclesDetector',['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html',1,'cv::cuda']]], + ['houghdeskewoption_528',['HoughDeskewOption',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a63f608e1fc7cbef07a95509fcf4881d2',1,'cv::ximgproc']]], + ['houghlines_529',['HoughLines',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga46b4e588934f6c8dfd509cc6e0e4545a',1,'cv::HoughLines()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga46b4e588934f6c8dfd509cc6e0e4545a',1,'HoughLines()(Global Namespace)']]], + ['houghlinesdetector_530',['HoughLinesDetector',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html',1,'cv::cuda']]], + ['houghlinesp_531',['HoughLinesP',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga8618180a5948286384e3b7ca02f6feeb',1,'cv::HoughLinesP()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga8618180a5948286384e3b7ca02f6feeb',1,'HoughLinesP()(Global Namespace)']]], + ['houghlinespointset_532',['HoughLinesPointSet',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga2858ef61b4e47d1919facac2152a160e',1,'cv::HoughLinesPointSet()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga2858ef61b4e47d1919facac2152a160e',1,'HoughLinesPointSet()(Global Namespace)']]], + ['houghmodes_533',['HoughModes',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga073687a5b96ac7a3ab5802eb5510fe65',1,'cv::HoughModes'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga073687a5b96ac7a3ab5802eb5510fe65',1,'HoughModes(Global Namespace)']]], + ['houghop_534',['HoughOp',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a998fc1e1cca9a365651dd9917205f991',1,'cv::ximgproc']]], + ['houghpoint2line_535',['HoughPoint2Line',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#aad77c2a5fbc2a891b705911b73ea33c7',1,'cv::ximgproc']]], + ['houghsegmentdetector_536',['HoughSegmentDetector',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html',1,'cv::cuda']]], + ['hours_537',['hours',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#a52153876127e925fa042a6c728367ad3',1,'std::chrono']]], + ['householder_20module_538',['Householder module',['https://eigen.tuxfamily.org/dox/group__Householder__Module.html',1,'']]], + ['householdercoefficients_539',['householderCoefficients',['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a65fa81ce79d956baa59a30a6d82f8a84',1,'Eigen::HessenbergDecomposition::householderCoefficients()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a65fa81ce79d956baa59a30a6d82f8a84',1,'HessenbergDecomposition< MatrixType >::householderCoefficients()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#ac95b4e43dcf6c3c5074b8bea4fc67887',1,'Eigen::Tridiagonalization::householderCoefficients()']]], + ['householderq_540',['householderQ',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a28ab9d8916ca609c5469c4c192fbfa28',1,'Eigen::ColPivHouseholderQR::householderQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a28ab9d8916ca609c5469c4c192fbfa28',1,'ColPivHouseholderQR< MatrixType >::householderQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ac95b93ddad59c6e57d06fcd4737b27e1',1,'Eigen::CompleteOrthogonalDecomposition::householderQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#affd506c10ef2d25f56e7b1f9f25ff885',1,'Eigen::HouseholderQR::householderQ()']]], + ['householderqr_541',['HouseholderQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html',1,'Eigen::HouseholderQR< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#a974adb10a0e066057aeb3b360df68380',1,'Eigen::HouseholderQR::HouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#afa7cfb4faa89195c4dc8d196924c8230',1,'Eigen::HouseholderQR::HouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#a95a53f8479ee147d7b0ccab71c13e45d',1,'Eigen::HouseholderQR::HouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#a1087457610c53e1574de521a51de0cd3',1,'Eigen::HouseholderQR::HouseholderQR(Index rows, Index cols)']]], + ['householderqr_542',['householderQr',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9a9377aab1cea26db5f25bab7e682f8f',1,'Eigen::MatrixBase::householderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9a9377aab1cea26db5f25bab7e682f8f',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::householderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9a9377aab1cea26db5f25bab7e682f8f',1,'MatrixBase< Solve< Decomposition, RhsType > >::householderQr()']]], + ['householderqrpreconditioner_543',['HouseholderQRPreconditioner',['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56ea9c660eb3336bf8c77ce9d081ca07cbdd',1,'Eigen::HouseholderQRPreconditioner'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56ea9c660eb3336bf8c77ce9d081ca07cbdd',1,'HouseholderQRPreconditioner(Global Namespace)']]], + ['householdersequence_544',['HouseholderSequence',['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html',1,'Eigen::HouseholderSequence< class, class, Side >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#aa4b1b93fff4d5c79342974d9d2a9eec8',1,'Eigen::HouseholderSequence::HouseholderSequence(const HouseholderSequence &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#af6aeede87ed8dac452f4fa8b4f45c3f2',1,'Eigen::HouseholderSequence::HouseholderSequence(const VectorsType &v, const CoeffsType &h)']]], + ['householdersequence_545',['householderSequence',['https://eigen.tuxfamily.org/dox/group__Householder__Module.html#ga5f2b3f80cdf7ae96609e4a8d2e55e371',1,'Eigen::householderSequence()'],['https://eigen.tuxfamily.org/dox/group__Householder__Module.html#ga5f2b3f80cdf7ae96609e4a8d2e55e371',1,'householderSequence()(Global Namespace)']]], + ['householdersequencetype_546',['HouseholderSequenceType',['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a7c1188cd5d8f550c8941df75a50a7d08',1,'Eigen::HessenbergDecomposition::HouseholderSequenceType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a7c1188cd5d8f550c8941df75a50a7d08',1,'HessenbergDecomposition< MatrixType >::HouseholderSequenceType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#af322315c8bea9990152c9d09bfa2a69f',1,'Eigen::Tridiagonalization::HouseholderSequenceType']]], + ['how_20opencv_20python_20bindings_20works_547',['How OpenCV-Python Bindings Works?',['https://docs.opencv.org/4.2.0/da/d49/tutorial_py_bindings_basics.html',1,'']]], + ['how_20to_20build_20applications_20with_20opencv_20inside_20the_20microsoft_20visual_20studio_548',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['how_20to_20enable_20halide_20backend_20for_20improve_20efficiency_549',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], + ['how_20to_20run_20deep_20networks_20in_20browser_550',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], + ['how_20to_20run_20deep_20networks_20on_20android_20device_551',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], + ['how_20to_20scan_20images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_552',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], + ['how_20to_20schedule_20your_20network_20for_20halide_20backend_553',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], + ['how_20to_20use_20background_20subtraction_20methods_554',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], + ['how_20to_20use_20the_20opencv_20parallel_5ffor_5f_20to_20parallelize_20your_20code_555',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], + ['how_5fto_5fcreate_5fgroups_2emarkdown_556',['how_to_create_groups.markdown',['https://docs.opencv.org/4.2.0/d7/d7b/how__to__create__groups_8markdown.html',1,'']]], + ['how_5fto_5fscan_5fimages_2emarkdown_557',['how_to_scan_images.markdown',['https://docs.opencv.org/4.2.0/d5/d91/how__to__scan__images_8markdown.html',1,'']]], + ['how_5fto_5fuse_5fopencv_5fparallel_5ffor_5f_2emarkdown_558',['how_to_use_OpenCV_parallel_for_.markdown',['https://docs.opencv.org/4.2.0/d5/d45/how__to__use__OpenCV__parallel__for___8markdown.html',1,'']]], + ['hpe_5fhumaneva_559',['HPE_humaneva',['https://docs.opencv.org/4.2.0/d5/d42/classcv_1_1datasets_1_1HPE__humaneva.html',1,'cv::datasets']]], + ['hpe_5fhumaneva_2ehpp_560',['hpe_humaneva.hpp',['https://docs.opencv.org/4.2.0/d8/da7/hpe__humaneva_8hpp.html',1,'']]], + ['hpe_5fhumanevaobj_561',['HPE_humanevaObj',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html',1,'cv::datasets']]], + ['hpe_5fparse_562',['HPE_parse',['https://docs.opencv.org/4.2.0/d6/d72/classcv_1_1datasets_1_1HPE__parse.html',1,'cv::datasets']]], + ['hpe_5fparse_2ehpp_563',['hpe_parse.hpp',['https://docs.opencv.org/4.2.0/da/da9/hpe__parse_8hpp.html',1,'']]], + ['hpe_5fparseobj_564',['HPE_parseObj',['https://docs.opencv.org/4.2.0/da/d82/structcv_1_1datasets_1_1HPE__parseObj.html',1,'cv::datasets']]], + ['hscale_565',['hscale',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a6fff8d52978f53170bb05a629ed35a92',1,'cv::QtFont']]], + ['hsv2rgb_566',['HSV2RGB',['https://docs.opencv.org/4.2.0/d8/d00/classcv_1_1cudev_1_1color__cvt__detail_1_1HSV2RGB.html',1,'cv::cudev::color_cvt_detail']]], + ['hsv4_5fto_5fbgr_5f_567',['HSV4_to_BGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf26d1e940991039021870b4964b0ce7',1,'cv::cudev::HSV4_to_BGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf26d1e940991039021870b4964b0ce7',1,'HSV4_to_BGR_()(Global Namespace)']]], + ['hsv4_5fto_5fbgr_5ffull_5f_568',['HSV4_to_BGR_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfc4461b88ed1db5298c8f62fa13d430',1,'cv::cudev::HSV4_to_BGR_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfc4461b88ed1db5298c8f62fa13d430',1,'HSV4_to_BGR_FULL_()(Global Namespace)']]], + ['hsv4_5fto_5fbgr_5ffull_5ffunc_569',['HSV4_to_BGR_FULL_func',['https://docs.opencv.org/4.2.0/d9/de1/structcv_1_1cudev_1_1HSV4__to__BGR__FULL__func.html',1,'cv::cudev']]], + ['hsv4_5fto_5fbgr_5ffull_5ffunc_3c_20float_20_3e_570',['HSV4_to_BGR_FULL_func< float >',['https://docs.opencv.org/4.2.0/d6/dd7/structcv_1_1cudev_1_1HSV4__to__BGR__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv4_5fto_5fbgr_5ffunc_571',['HSV4_to_BGR_func',['https://docs.opencv.org/4.2.0/d8/d65/structcv_1_1cudev_1_1HSV4__to__BGR__func.html',1,'cv::cudev']]], + ['hsv4_5fto_5fbgr_5ffunc_3c_20float_20_3e_572',['HSV4_to_BGR_func< float >',['https://docs.opencv.org/4.2.0/d2/d2c/structcv_1_1cudev_1_1HSV4__to__BGR__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv4_5fto_5fbgra_5f_573',['HSV4_to_BGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2b7deb90fc0359bc7bad75f3d55bb09',1,'cv::cudev::HSV4_to_BGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2b7deb90fc0359bc7bad75f3d55bb09',1,'HSV4_to_BGRA_()(Global Namespace)']]], + ['hsv4_5fto_5fbgra_5ffull_5f_574',['HSV4_to_BGRA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa45f91205b1a4033d538cf3bc35481f8',1,'cv::cudev::HSV4_to_BGRA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa45f91205b1a4033d538cf3bc35481f8',1,'HSV4_to_BGRA_FULL_()(Global Namespace)']]], + ['hsv4_5fto_5fbgra_5ffull_5ffunc_575',['HSV4_to_BGRA_FULL_func',['https://docs.opencv.org/4.2.0/d7/d58/structcv_1_1cudev_1_1HSV4__to__BGRA__FULL__func.html',1,'cv::cudev']]], + ['hsv4_5fto_5fbgra_5ffull_5ffunc_3c_20float_20_3e_576',['HSV4_to_BGRA_FULL_func< float >',['https://docs.opencv.org/4.2.0/d5/d91/structcv_1_1cudev_1_1HSV4__to__BGRA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv4_5fto_5fbgra_5ffunc_577',['HSV4_to_BGRA_func',['https://docs.opencv.org/4.2.0/de/d80/structcv_1_1cudev_1_1HSV4__to__BGRA__func.html',1,'cv::cudev']]], + ['hsv4_5fto_5fbgra_5ffunc_3c_20float_20_3e_578',['HSV4_to_BGRA_func< float >',['https://docs.opencv.org/4.2.0/dc/dc6/structcv_1_1cudev_1_1HSV4__to__BGRA__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv4_5fto_5frgb_5f_579',['HSV4_to_RGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffad45b6fe24ba643e340fa0dfdf6286',1,'cv::cudev::HSV4_to_RGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffad45b6fe24ba643e340fa0dfdf6286',1,'HSV4_to_RGB_()(Global Namespace)']]], + ['hsv4_5fto_5frgb_5ffull_5f_580',['HSV4_to_RGB_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae23caa3af3f3546a22499a7f98492a28',1,'cv::cudev::HSV4_to_RGB_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae23caa3af3f3546a22499a7f98492a28',1,'HSV4_to_RGB_FULL_()(Global Namespace)']]], + ['hsv4_5fto_5frgb_5ffull_5ffunc_581',['HSV4_to_RGB_FULL_func',['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1cudev_1_1HSV4__to__RGB__FULL__func.html',1,'cv::cudev']]], + ['hsv4_5fto_5frgb_5ffull_5ffunc_3c_20float_20_3e_582',['HSV4_to_RGB_FULL_func< float >',['https://docs.opencv.org/4.2.0/dd/d6b/structcv_1_1cudev_1_1HSV4__to__RGB__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv4_5fto_5frgb_5ffunc_583',['HSV4_to_RGB_func',['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1HSV4__to__RGB__func.html',1,'cv::cudev']]], + ['hsv4_5fto_5frgb_5ffunc_3c_20float_20_3e_584',['HSV4_to_RGB_func< float >',['https://docs.opencv.org/4.2.0/d1/d95/structcv_1_1cudev_1_1HSV4__to__RGB__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv4_5fto_5frgba_5f_585',['HSV4_to_RGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf17e206202c7f1b7276f23160ea2570b',1,'cv::cudev::HSV4_to_RGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf17e206202c7f1b7276f23160ea2570b',1,'HSV4_to_RGBA_()(Global Namespace)']]], + ['hsv4_5fto_5frgba_5ffull_5f_586',['HSV4_to_RGBA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3ced2be51a3939259d1ac1e346d39eb',1,'cv::cudev::HSV4_to_RGBA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3ced2be51a3939259d1ac1e346d39eb',1,'HSV4_to_RGBA_FULL_()(Global Namespace)']]], + ['hsv4_5fto_5frgba_5ffull_5ffunc_587',['HSV4_to_RGBA_FULL_func',['https://docs.opencv.org/4.2.0/d7/d30/structcv_1_1cudev_1_1HSV4__to__RGBA__FULL__func.html',1,'cv::cudev']]], + ['hsv4_5fto_5frgba_5ffull_5ffunc_3c_20float_20_3e_588',['HSV4_to_RGBA_FULL_func< float >',['https://docs.opencv.org/4.2.0/df/d03/structcv_1_1cudev_1_1HSV4__to__RGBA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv4_5fto_5frgba_5ffunc_589',['HSV4_to_RGBA_func',['https://docs.opencv.org/4.2.0/d5/dea/structcv_1_1cudev_1_1HSV4__to__RGBA__func.html',1,'cv::cudev']]], + ['hsv4_5fto_5frgba_5ffunc_3c_20float_20_3e_590',['HSV4_to_RGBA_func< float >',['https://docs.opencv.org/4.2.0/d7/d18/structcv_1_1cudev_1_1HSV4__to__RGBA__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv_5fto_5fbgr_5f_591',['HSV_to_BGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82b218484b6caf2656b989f5e9fef676',1,'cv::cudev::HSV_to_BGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82b218484b6caf2656b989f5e9fef676',1,'HSV_to_BGR_()(Global Namespace)']]], + ['hsv_5fto_5fbgr_5ffull_5f_592',['HSV_to_BGR_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ce1c4c00131922871824f973f8dab24',1,'cv::cudev::HSV_to_BGR_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ce1c4c00131922871824f973f8dab24',1,'HSV_to_BGR_FULL_()(Global Namespace)']]], + ['hsv_5fto_5fbgr_5ffull_5ffunc_593',['HSV_to_BGR_FULL_func',['https://docs.opencv.org/4.2.0/d0/da4/structcv_1_1cudev_1_1HSV__to__BGR__FULL__func.html',1,'cv::cudev']]], + ['hsv_5fto_5fbgr_5ffull_5ffunc_3c_20float_20_3e_594',['HSV_to_BGR_FULL_func< float >',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1cudev_1_1HSV__to__BGR__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv_5fto_5fbgr_5ffunc_595',['HSV_to_BGR_func',['https://docs.opencv.org/4.2.0/d9/d4c/structcv_1_1cudev_1_1HSV__to__BGR__func.html',1,'cv::cudev']]], + ['hsv_5fto_5fbgr_5ffunc_3c_20float_20_3e_596',['HSV_to_BGR_func< float >',['https://docs.opencv.org/4.2.0/df/dd5/structcv_1_1cudev_1_1HSV__to__BGR__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv_5fto_5fbgra_5f_597',['HSV_to_BGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd639c9f834a5b48797c3a4cb42d3c4',1,'cv::cudev::HSV_to_BGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd639c9f834a5b48797c3a4cb42d3c4',1,'HSV_to_BGRA_()(Global Namespace)']]], + ['hsv_5fto_5fbgra_5ffull_5f_598',['HSV_to_BGRA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d0f07bfc5d937b9712c3badaaaac75a',1,'cv::cudev::HSV_to_BGRA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d0f07bfc5d937b9712c3badaaaac75a',1,'HSV_to_BGRA_FULL_()(Global Namespace)']]], + ['hsv_5fto_5fbgra_5ffull_5ffunc_599',['HSV_to_BGRA_FULL_func',['https://docs.opencv.org/4.2.0/dc/d25/structcv_1_1cudev_1_1HSV__to__BGRA__FULL__func.html',1,'cv::cudev']]], + ['hsv_5fto_5fbgra_5ffull_5ffunc_3c_20float_20_3e_600',['HSV_to_BGRA_FULL_func< float >',['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1HSV__to__BGRA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv_5fto_5fbgra_5ffunc_601',['HSV_to_BGRA_func',['https://docs.opencv.org/4.2.0/d2/d8f/structcv_1_1cudev_1_1HSV__to__BGRA__func.html',1,'cv::cudev']]], + ['hsv_5fto_5fbgra_5ffunc_3c_20float_20_3e_602',['HSV_to_BGRA_func< float >',['https://docs.opencv.org/4.2.0/d3/db4/structcv_1_1cudev_1_1HSV__to__BGRA__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv_5fto_5frgb_5f_603',['HSV_to_RGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43b8acc36d3be756174c8a7da2658497',1,'cv::cudev::HSV_to_RGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43b8acc36d3be756174c8a7da2658497',1,'HSV_to_RGB_()(Global Namespace)']]], + ['hsv_5fto_5frgb_5ffull_5f_604',['HSV_to_RGB_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fba245bdd2a25b2c8c5b73fc22a9cce',1,'cv::cudev::HSV_to_RGB_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fba245bdd2a25b2c8c5b73fc22a9cce',1,'HSV_to_RGB_FULL_()(Global Namespace)']]], + ['hsv_5fto_5frgb_5ffull_5ffunc_605',['HSV_to_RGB_FULL_func',['https://docs.opencv.org/4.2.0/d7/d86/structcv_1_1cudev_1_1HSV__to__RGB__FULL__func.html',1,'cv::cudev']]], + ['hsv_5fto_5frgb_5ffull_5ffunc_3c_20float_20_3e_606',['HSV_to_RGB_FULL_func< float >',['https://docs.opencv.org/4.2.0/dc/d25/structcv_1_1cudev_1_1HSV__to__RGB__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv_5fto_5frgb_5ffunc_607',['HSV_to_RGB_func',['https://docs.opencv.org/4.2.0/d8/d1e/structcv_1_1cudev_1_1HSV__to__RGB__func.html',1,'cv::cudev']]], + ['hsv_5fto_5frgb_5ffunc_3c_20float_20_3e_608',['HSV_to_RGB_func< float >',['https://docs.opencv.org/4.2.0/d2/d73/structcv_1_1cudev_1_1HSV__to__RGB__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv_5fto_5frgba_5f_609',['HSV_to_RGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad42efde80cb6059da6517070b631a18f',1,'cv::cudev::HSV_to_RGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad42efde80cb6059da6517070b631a18f',1,'HSV_to_RGBA_()(Global Namespace)']]], + ['hsv_5fto_5frgba_5ffull_5f_610',['HSV_to_RGBA_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f6dceaee6cca4db97ef093899def638',1,'cv::cudev::HSV_to_RGBA_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f6dceaee6cca4db97ef093899def638',1,'HSV_to_RGBA_FULL_()(Global Namespace)']]], + ['hsv_5fto_5frgba_5ffull_5ffunc_611',['HSV_to_RGBA_FULL_func',['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1HSV__to__RGBA__FULL__func.html',1,'cv::cudev']]], + ['hsv_5fto_5frgba_5ffull_5ffunc_3c_20float_20_3e_612',['HSV_to_RGBA_FULL_func< float >',['https://docs.opencv.org/4.2.0/de/dda/structcv_1_1cudev_1_1HSV__to__RGBA__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hsv_5fto_5frgba_5ffunc_613',['HSV_to_RGBA_func',['https://docs.opencv.org/4.2.0/df/d10/structcv_1_1cudev_1_1HSV__to__RGBA__func.html',1,'cv::cudev']]], + ['hsv_5fto_5frgba_5ffunc_3c_20float_20_3e_614',['HSV_to_RGBA_func< float >',['https://docs.opencv.org/4.2.0/d8/dff/structcv_1_1cudev_1_1HSV__to__RGBA__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hugecost_615',['HugeCost',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a3163430a1c13173faffde69016b48aaf',1,'Eigen']]], + ['hull_616',['Convex Hull',['https://docs.opencv.org/4.2.0/d7/d1d/tutorial_hull.html',1,'']]], + ['hull_2emarkdown_617',['hull.markdown',['https://docs.opencv.org/4.2.0/d0/dbd/hull_8markdown.html',1,'']]], + ['human_20pose_20estimation_618',['Human Pose Estimation',['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html',1,'']]], + ['human_20retina_20and_20its_20use_20for_20image_20processing_619',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], + ['humaneva_5f1_620',['humaneva_1',['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html#gga570cd866657e421a9d34fd891214cdaca58a323dca9edfd3fa43b0c2a90218743',1,'cv::datasets::humaneva_1'],['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html#gga570cd866657e421a9d34fd891214cdaca58a323dca9edfd3fa43b0c2a90218743',1,'humaneva_1(Global Namespace)']]], + ['humaneva_5f2_621',['humaneva_2',['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html#gga570cd866657e421a9d34fd891214cdaca367d42dd71351d8c381ddad686308f0e',1,'cv::datasets::humaneva_2'],['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html#gga570cd866657e421a9d34fd891214cdaca367d42dd71351d8c381ddad686308f0e',1,'humaneva_2(Global Namespace)']]], + ['humanseg_622',['humanSeg',['https://docs.opencv.org/4.2.0/d8/d65/structcv_1_1datasets_1_1IS__weizmannObj.html#a657b127a842bb3ab4bf9a496cf0cf208',1,'cv::datasets::IS_weizmannObj']]], + ['humoments_623',['HuMoments',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gab001db45c1f1af6cbdbe64df04c4e944',1,'cv::HuMoments(const Moments &moments, double hu[7])'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga6d6ac1b519cba25190119afe3a52c1cc',1,'cv::HuMoments(const Moments &m, OutputArray hu)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gab001db45c1f1af6cbdbe64df04c4e944',1,'HuMoments(const Moments &moments, double hu[7])(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga6d6ac1b519cba25190119afe3a52c1cc',1,'HuMoments(const Moments &m, OutputArray hu)(Global Namespace)']]], + ['hyperg_624',['hyperg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#af52cf49736c63b0bb000be98b53c221f',1,'__gnu_cxx::hyperg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01550.html#af320db7639ced3d53b1b86cf8f2aaa3f',1,'std::tr1::hyperg()']]], + ['hypergf_625',['hypergf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ac4c81e4ea9cef149fe40291ca10d7e15',1,'__gnu_cxx']]], + ['hypergl_626',['hypergl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a9961967087216e97f76283f29e1be152',1,'__gnu_cxx']]], + ['hyperplane_627',['Hyperplane',['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html',1,'Eigen::Hyperplane< class, _AmbientDim, _Options >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#aa19ee87ada63fa6576bf61517424b1b3',1,'Eigen::Hyperplane::Hyperplane()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ae03c337cae9fd43396f92b9e97e600b1',1,'Eigen::Hyperplane::Hyperplane(const Hyperplane< OtherScalarType, AmbientDimAtCompileTime, OtherOptions > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ad05d941675fd03b46dd1029f2f0c95ea',1,'Eigen::Hyperplane::Hyperplane(const ParametrizedLine< Scalar, AmbientDimAtCompileTime > &parametrized)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a76a1ed93c5f7e3a9aba4f029809d6ebc',1,'Eigen::Hyperplane::Hyperplane(const VectorType &n, const Scalar &d)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a0f9ca82a2cf12753da3a007e128631f8',1,'Eigen::Hyperplane::Hyperplane(const VectorType &n, const VectorType &e)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a75aebf8b553ea33a193ea94583a7f830',1,'Eigen::Hyperplane::Hyperplane(Index _dim)']]], + ['hypot_628',['hypot',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3de325d007af83e37038f276f0075f37',1,'cv::cudev::hypot(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d19807d7720955e8c60a1360488391',1,'cv::cudev::hypot(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2837133d9a05258561700df5a26880df',1,'cv::cudev::hypot(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5476184a23c83d1017b3921339744e86',1,'cv::cudev::hypot(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ab6c2da2a5ebff78676dc96cb3c8b53',1,'cv::cudev::hypot(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9a708875710084583930f8a4d49cadd',1,'cv::cudev::hypot(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b765c0093d928f09a219c0c95b46dc3',1,'cv::cudev::hypot(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46ed1fd750b263ea43a69347ddee79c9',1,'cv::cudev::hypot(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46d5a3623693c46012581ca6ddc0795b',1,'cv::cudev::hypot(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab03f9453516a83f67ba4c198d5fc2273',1,'cv::cudev::hypot(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5777fbbe63ab5bd4e84df3453adf2834',1,'cv::cudev::hypot(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad122ad9cf51fa3979c5ebd34861f48',1,'cv::cudev::hypot(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5052b8704ce8cf93c419b8921c89716a',1,'cv::cudev::hypot(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88d038ec76d27f2d913476d07190b159',1,'cv::cudev::hypot(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d1b87445f03882e446ea21a8b6b5189',1,'cv::cudev::hypot(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadf8d879a9b9f7a1f204488708081c29',1,'cv::cudev::hypot(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f457b58ca512c0a9bff8579bc704c76',1,'cv::cudev::hypot(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2284f04e5c0378bcdbe6216bfdc11f52',1,'cv::cudev::hypot(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56baedaf61f69acae5f872a08bd0281d',1,'cv::cudev::hypot(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69d6dae9232bfde87bb3c28b11a885b7',1,'cv::cudev::hypot(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0b8935d90a412555caf3aac471815f1',1,'cv::cudev::hypot(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb921b67e516784306f9a1e699370ab7',1,'cv::cudev::hypot(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85fd6b44a40a4f5fa2feb9b91e4c8a58',1,'cv::cudev::hypot(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a4223dec414b3abdf6d1cc49f3af665',1,'cv::cudev::hypot(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bf8ea2b595c1c6b942f68ab05ce8aeb',1,'cv::cudev::hypot(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a4395a965a7c45e3ac5ec122e1a9f54',1,'cv::cudev::hypot(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7448a501833b6ac74cfea12506aa8a6',1,'cv::cudev::hypot(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ef9edbbd62500592e33808a8da79e1e',1,'cv::cudev::hypot(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84f32d88196f39f79c5e9acba5c5b756',1,'cv::cudev::hypot(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf686dc7b270524f0e89f574c4fd27a30',1,'cv::cudev::hypot(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga295499364626876c090b970f532db885',1,'cv::cudev::hypot(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa062be7da49aa532bceb7be29abe584e',1,'cv::cudev::hypot(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65d7e0aa99f5bad1d52a75367ac15aea',1,'cv::cudev::hypot(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c917fef38a465fca73545eb52dc3794',1,'cv::cudev::hypot(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa505d8a5c7d4b16e2feb6feb030aad70',1,'cv::cudev::hypot(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacee2aa0efc09ab3a73e1bb59efb61fa7',1,'cv::cudev::hypot(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdee1be11e9c9623c520cc7f68189d82',1,'cv::cudev::hypot(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga940a210370a35ecb4b5eb093360a8573',1,'cv::cudev::hypot(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cfb49232d9de5ac9acc8344d6296ea1',1,'cv::cudev::hypot(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga846563089a662b104d61bb35a798b1ca',1,'cv::cudev::hypot(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2931f849ca79d74332e3194f58a06a01',1,'cv::cudev::hypot(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02f072b2a8361fc13a837fd54830842f',1,'cv::cudev::hypot(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d6c2e8723743e7b4f13d0d1c621a197',1,'cv::cudev::hypot(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21bd4bfb94fb00ca9b5cd7c88214ba70',1,'cv::cudev::hypot(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ea0c820b99f5fe7a5b87581059db7a9',1,'cv::cudev::hypot(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9698a3d8d27dd3f6eda99a8023bf609e',1,'cv::cudev::hypot(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9c95e4921bbed34fa035f59b03c8711',1,'cv::cudev::hypot(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga254699c5e81c6be8ded978ae66370649',1,'cv::cudev::hypot(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08ee789e2698654a1e6dbdccac0ef2c8',1,'cv::cudev::hypot(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa51bef4fe848cf683993d7399715ca24',1,'cv::cudev::hypot(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga417c566a65ab5092a705e61ee7b0c5f0',1,'cv::cudev::hypot(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf692ac6d3707e0e37ef26ffbd3787361',1,'cv::cudev::hypot(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5342f304a59e8de44a2ecad14fd7c287',1,'cv::cudev::hypot(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81dd4a1ecf60637d8027ed38e767ee05',1,'cv::cudev::hypot(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4abdd0d7c4929b85e1d0e3062a19499',1,'cv::cudev::hypot(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac04c9c20834dbf76468bdd0d729099fc',1,'cv::cudev::hypot(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3661cadd91faeaf1eb02b005f11106f',1,'cv::cudev::hypot(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaec0a8578e690cfeff325e719ca5909c',1,'cv::cudev::hypot(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0815869e7df0dee8926e66337f98232b',1,'cv::cudev::hypot(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fb153dd56576e2e29b24560fda78342',1,'cv::cudev::hypot(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f3f6388cc78ce256de7fb8dd9990b92',1,'cv::cudev::hypot(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3455b906ce3ac0b957743a7d1b2d1d2',1,'cv::cudev::hypot(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e341002f3c5c1cd0a394cb66d0565c8',1,'cv::cudev::hypot(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a741ac32cc37fb7522c602fb01d71cd',1,'cv::cudev::hypot(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga514230ee6c217ca3ba495898ee4b1eb9',1,'cv::cudev::hypot(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3cbe3347aebcc8fcb84bc9ca44dd260',1,'cv::cudev::hypot(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e134ce1665a1b7d247548443e637ba',1,'cv::cudev::hypot(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ffcd3b9d022ae9fbccf2763ebb21e3d',1,'cv::cudev::hypot(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac9ead9fd9c082cc0901012f62f6e88b',1,'cv::cudev::hypot(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d63c7947467900bc9496393e9a5e07a',1,'cv::cudev::hypot(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9d3281b1cf6200a2e43cb4e3e9d31e4',1,'cv::cudev::hypot(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42bb87274411e6cdba942a8cae45d4ce',1,'cv::cudev::hypot(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb3a415a3ec64853422327dd38a41796',1,'cv::cudev::hypot(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga951ece2f9524c9c5c78e465c984fe9ca',1,'cv::cudev::hypot(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf86a282592a40893744b84f17afdec6c',1,'cv::cudev::hypot(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d0cbb20d17cd126fe25d6724cdfd21',1,'cv::cudev::hypot(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe98a9a4191c164d0dc0c6a13b0ac6f8',1,'cv::cudev::hypot(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5e604f4e2308d2c01d6d1e127131058',1,'cv::cudev::hypot(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98f7f2efa4e9385ffcd471648a34e2db',1,'cv::cudev::hypot(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad05339f8c1b091f6e0b2699011cd0063',1,'cv::cudev::hypot(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae961d6c5f5a09edaea1e28f8bff135a9',1,'cv::cudev::hypot(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac266b9ef346b1ea9f5176cec6b77ac1a',1,'cv::cudev::hypot(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga940fb7de42319c5cb16f374f8838ab80',1,'cv::cudev::hypot(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae52ad07ad9e7d6df604b7590fb88fb0c',1,'cv::cudev::hypot(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5477ba938004737b396f23a2994c0e41',1,'cv::cudev::hypot(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab42a1d1d7877273cc748f441eef18da',1,'cv::cudev::hypot(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa23b3b8964333c6eeff3cf318e002c70',1,'cv::cudev::hypot(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d4067058bb20a44e729d9fd1787f65',1,'cv::cudev::hypot(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5b28ba05711baaad9cad7f5db2b657',1,'cv::cudev::hypot(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac85d50f6f5642687737f6aead2c2d0c7',1,'cv::cudev::hypot(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf798393fa860625a567389b68fb2e07',1,'cv::cudev::hypot(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6df029f27ddbba98d2b84d5f960b6b71',1,'cv::cudev::hypot(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfa1e048923646d7d18ebc7e5c6ff093',1,'cv::cudev::hypot(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e465937603ed228606cb2c541240d03',1,'cv::cudev::hypot(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa269982371abff271f7cd3236f83238a',1,'cv::cudev::hypot(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa614ce5ee397fb0016e6c26e98c99818',1,'cv::cudev::hypot(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70f8662b9abf3d77cd9e98c93b8eea34',1,'cv::cudev::hypot(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a638cd87ed01357d41c28c83a927d59',1,'cv::cudev::hypot(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d0b42426aa05b9a400212b2ea5c27cb',1,'cv::cudev::hypot(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b17d81fb2ab2c5685e0e4344e014e90',1,'cv::cudev::hypot(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f3920922dec566e697f844deab6efc',1,'cv::cudev::hypot(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7d1f369bbf04f37426975fa26dd3d39',1,'cv::cudev::hypot(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2640f7b24bd4c5ce16d9032da9f841b4',1,'cv::cudev::hypot(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab84aedaf5c87ca9aa11e55a0927849c',1,'cv::cudev::hypot(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80d0c0c307bc97eb5ad48977ca84b825',1,'cv::cudev::hypot(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3bde2ac36f65591eead2749f7a1c48e',1,'cv::cudev::hypot(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga762fc3af5da6ac3b2dc7184e04fe7db8',1,'cv::cudev::hypot(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3cd6e2c5464c5b81d179c594eeb1d629',1,'cv::cudev::hypot(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f8d3813add59b6373ed4c4a3c9ebd6',1,'cv::cudev::hypot(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff42a3082380dbde708ed030fdf926e',1,'cv::cudev::hypot(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad993a6a07164cce632d0718468556815',1,'cv::cudev::hypot(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae62108221a9c33cfef28c1b8c35f7ded',1,'cv::cudev::hypot(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa66765aef1a6b96797a6b2c6794d1e23',1,'cv::cudev::hypot(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga065b045f306d1d0734814646a0e5ac86',1,'cv::cudev::hypot(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9625895633014827d120c19b56a0fa69',1,'cv::cudev::hypot(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d3263772a7c0cb57d4d10c9ab6a0e19',1,'cv::cudev::hypot(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac982534b2123826b736f0959de52cbe2',1,'cv::cudev::hypot(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga809de16c6e2c5223c24267ccf2512a99',1,'cv::cudev::hypot(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga011392527ff73805d16269b8417e1771',1,'cv::cudev::hypot(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga962bb96ce3d106dc7afdaeaef9499b8b',1,'cv::cudev::hypot(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ab9da1f27485f833c0c0afce93907d2',1,'cv::cudev::hypot(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga293ab0f46540f4becd49692358114c0e',1,'cv::cudev::hypot(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5118fa415bd8914cdb981aae79c2a0b2',1,'cv::cudev::hypot(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00b1ebd70b412a665918c5266f5ec09d',1,'cv::cudev::hypot(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e73831dadab469aa47ed24fa174b9cd',1,'cv::cudev::hypot(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f3e69ae032d99664631892884f3f55a',1,'cv::cudev::hypot(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c22ee105e405c46e5e7acbdb77d72f7',1,'cv::cudev::hypot(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60c8df5704ce0f85f62e4479cf06d031',1,'cv::cudev::hypot(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5485aa3b7f159b5acba4efbc4392383c',1,'cv::cudev::hypot(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba960bca3a54e7dd3621eebc646af3d7',1,'cv::cudev::hypot(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ee9559ae09429b769888252bfbfe4ab',1,'cv::cudev::hypot(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5480779c7f1a0e7f5e9d2d7b4d089a76',1,'cv::cudev::hypot(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5dbecfe0734bade368f93f6da10649aa',1,'cv::cudev::hypot(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a61ebafdaff685afb93927a6e324788',1,'cv::cudev::hypot(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08b8090712b081338c8f61bc6faff114',1,'cv::cudev::hypot(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab443983069f8d009392505898853d19e',1,'cv::cudev::hypot(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc0a537253f3b8e2a9c4442e47abdcc',1,'cv::cudev::hypot(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c1eb238c64b78b9569d5f647843a4f5',1,'cv::cudev::hypot(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bbe8d2395e710658c1dbafbc1a17980',1,'cv::cudev::hypot(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacbaf22ad8cbb046ab3a096504f415d55',1,'cv::cudev::hypot(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b6147ad368eee4533098d0961621789',1,'cv::cudev::hypot(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga003fe1965f549f6ebe4ceb27e9a7782a',1,'cv::cudev::hypot(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80e633d6154d43204c37b7d243c7808a',1,'cv::cudev::hypot(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa84447ffe361b8896577711fed43ea29',1,'cv::cudev::hypot(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga261cd4cd5ab353536e09b84803c64cc0',1,'cv::cudev::hypot(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24e0a3ca9046296a6017b484a409a22a',1,'cv::cudev::hypot(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d538f7eb05fdeab85fa59f73f909b40',1,'cv::cudev::hypot(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be0d88867e3629d17ed7d709bda3151',1,'cv::cudev::hypot(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36f1096e7b4db4cb7fc14abf31a7dc4f',1,'cv::cudev::hypot(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae752017a11bc8039a4ee8113e5adb70c',1,'cv::cudev::hypot(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8506e061868a9d0b56860b966f119dad',1,'cv::cudev::hypot(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f4936864a32235503000102f5e0cb8f',1,'cv::cudev::hypot(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3de325d007af83e37038f276f0075f37',1,'hypot(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d19807d7720955e8c60a1360488391',1,'hypot(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2837133d9a05258561700df5a26880df',1,'hypot(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5476184a23c83d1017b3921339744e86',1,'hypot(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ab6c2da2a5ebff78676dc96cb3c8b53',1,'hypot(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9a708875710084583930f8a4d49cadd',1,'hypot(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b765c0093d928f09a219c0c95b46dc3',1,'hypot(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46ed1fd750b263ea43a69347ddee79c9',1,'hypot(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46d5a3623693c46012581ca6ddc0795b',1,'hypot(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab03f9453516a83f67ba4c198d5fc2273',1,'hypot(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5777fbbe63ab5bd4e84df3453adf2834',1,'hypot(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad122ad9cf51fa3979c5ebd34861f48',1,'hypot(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5052b8704ce8cf93c419b8921c89716a',1,'hypot(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88d038ec76d27f2d913476d07190b159',1,'hypot(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d1b87445f03882e446ea21a8b6b5189',1,'hypot(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadf8d879a9b9f7a1f204488708081c29',1,'hypot(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f457b58ca512c0a9bff8579bc704c76',1,'hypot(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2284f04e5c0378bcdbe6216bfdc11f52',1,'hypot(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56baedaf61f69acae5f872a08bd0281d',1,'hypot(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69d6dae9232bfde87bb3c28b11a885b7',1,'hypot(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0b8935d90a412555caf3aac471815f1',1,'hypot(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb921b67e516784306f9a1e699370ab7',1,'hypot(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85fd6b44a40a4f5fa2feb9b91e4c8a58',1,'hypot(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a4223dec414b3abdf6d1cc49f3af665',1,'hypot(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bf8ea2b595c1c6b942f68ab05ce8aeb',1,'hypot(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a4395a965a7c45e3ac5ec122e1a9f54',1,'hypot(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7448a501833b6ac74cfea12506aa8a6',1,'hypot(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ef9edbbd62500592e33808a8da79e1e',1,'hypot(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84f32d88196f39f79c5e9acba5c5b756',1,'hypot(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf686dc7b270524f0e89f574c4fd27a30',1,'hypot(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga295499364626876c090b970f532db885',1,'hypot(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa062be7da49aa532bceb7be29abe584e',1,'hypot(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65d7e0aa99f5bad1d52a75367ac15aea',1,'hypot(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c917fef38a465fca73545eb52dc3794',1,'hypot(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa505d8a5c7d4b16e2feb6feb030aad70',1,'hypot(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacee2aa0efc09ab3a73e1bb59efb61fa7',1,'hypot(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdee1be11e9c9623c520cc7f68189d82',1,'hypot(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga940a210370a35ecb4b5eb093360a8573',1,'hypot(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cfb49232d9de5ac9acc8344d6296ea1',1,'hypot(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga846563089a662b104d61bb35a798b1ca',1,'hypot(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2931f849ca79d74332e3194f58a06a01',1,'hypot(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02f072b2a8361fc13a837fd54830842f',1,'hypot(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d6c2e8723743e7b4f13d0d1c621a197',1,'hypot(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21bd4bfb94fb00ca9b5cd7c88214ba70',1,'hypot(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ea0c820b99f5fe7a5b87581059db7a9',1,'hypot(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9698a3d8d27dd3f6eda99a8023bf609e',1,'hypot(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9c95e4921bbed34fa035f59b03c8711',1,'hypot(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga254699c5e81c6be8ded978ae66370649',1,'hypot(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08ee789e2698654a1e6dbdccac0ef2c8',1,'hypot(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa51bef4fe848cf683993d7399715ca24',1,'hypot(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga417c566a65ab5092a705e61ee7b0c5f0',1,'hypot(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf692ac6d3707e0e37ef26ffbd3787361',1,'hypot(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5342f304a59e8de44a2ecad14fd7c287',1,'hypot(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81dd4a1ecf60637d8027ed38e767ee05',1,'hypot(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4abdd0d7c4929b85e1d0e3062a19499',1,'hypot(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac04c9c20834dbf76468bdd0d729099fc',1,'hypot(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3661cadd91faeaf1eb02b005f11106f',1,'hypot(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaec0a8578e690cfeff325e719ca5909c',1,'hypot(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0815869e7df0dee8926e66337f98232b',1,'hypot(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fb153dd56576e2e29b24560fda78342',1,'hypot(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f3f6388cc78ce256de7fb8dd9990b92',1,'hypot(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3455b906ce3ac0b957743a7d1b2d1d2',1,'hypot(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e341002f3c5c1cd0a394cb66d0565c8',1,'hypot(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a741ac32cc37fb7522c602fb01d71cd',1,'hypot(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga514230ee6c217ca3ba495898ee4b1eb9',1,'hypot(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3cbe3347aebcc8fcb84bc9ca44dd260',1,'hypot(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e134ce1665a1b7d247548443e637ba',1,'hypot(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ffcd3b9d022ae9fbccf2763ebb21e3d',1,'hypot(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac9ead9fd9c082cc0901012f62f6e88b',1,'hypot(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d63c7947467900bc9496393e9a5e07a',1,'hypot(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9d3281b1cf6200a2e43cb4e3e9d31e4',1,'hypot(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42bb87274411e6cdba942a8cae45d4ce',1,'hypot(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb3a415a3ec64853422327dd38a41796',1,'hypot(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga951ece2f9524c9c5c78e465c984fe9ca',1,'hypot(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf86a282592a40893744b84f17afdec6c',1,'hypot(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d0cbb20d17cd126fe25d6724cdfd21',1,'hypot(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe98a9a4191c164d0dc0c6a13b0ac6f8',1,'hypot(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5e604f4e2308d2c01d6d1e127131058',1,'hypot(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98f7f2efa4e9385ffcd471648a34e2db',1,'hypot(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad05339f8c1b091f6e0b2699011cd0063',1,'hypot(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae961d6c5f5a09edaea1e28f8bff135a9',1,'hypot(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac266b9ef346b1ea9f5176cec6b77ac1a',1,'hypot(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga940fb7de42319c5cb16f374f8838ab80',1,'hypot(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae52ad07ad9e7d6df604b7590fb88fb0c',1,'hypot(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5477ba938004737b396f23a2994c0e41',1,'hypot(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab42a1d1d7877273cc748f441eef18da',1,'hypot(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa23b3b8964333c6eeff3cf318e002c70',1,'hypot(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d4067058bb20a44e729d9fd1787f65',1,'hypot(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5b28ba05711baaad9cad7f5db2b657',1,'hypot(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac85d50f6f5642687737f6aead2c2d0c7',1,'hypot(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf798393fa860625a567389b68fb2e07',1,'hypot(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6df029f27ddbba98d2b84d5f960b6b71',1,'hypot(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfa1e048923646d7d18ebc7e5c6ff093',1,'hypot(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e465937603ed228606cb2c541240d03',1,'hypot(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa269982371abff271f7cd3236f83238a',1,'hypot(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa614ce5ee397fb0016e6c26e98c99818',1,'hypot(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70f8662b9abf3d77cd9e98c93b8eea34',1,'hypot(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a638cd87ed01357d41c28c83a927d59',1,'hypot(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d0b42426aa05b9a400212b2ea5c27cb',1,'hypot(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b17d81fb2ab2c5685e0e4344e014e90',1,'hypot(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f3920922dec566e697f844deab6efc',1,'hypot(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7d1f369bbf04f37426975fa26dd3d39',1,'hypot(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2640f7b24bd4c5ce16d9032da9f841b4',1,'hypot(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab84aedaf5c87ca9aa11e55a0927849c',1,'hypot(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80d0c0c307bc97eb5ad48977ca84b825',1,'hypot(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3bde2ac36f65591eead2749f7a1c48e',1,'hypot(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga762fc3af5da6ac3b2dc7184e04fe7db8',1,'hypot(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3cd6e2c5464c5b81d179c594eeb1d629',1,'hypot(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f8d3813add59b6373ed4c4a3c9ebd6',1,'hypot(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff42a3082380dbde708ed030fdf926e',1,'hypot(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad993a6a07164cce632d0718468556815',1,'hypot(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae62108221a9c33cfef28c1b8c35f7ded',1,'hypot(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa66765aef1a6b96797a6b2c6794d1e23',1,'hypot(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga065b045f306d1d0734814646a0e5ac86',1,'hypot(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9625895633014827d120c19b56a0fa69',1,'hypot(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d3263772a7c0cb57d4d10c9ab6a0e19',1,'hypot(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac982534b2123826b736f0959de52cbe2',1,'hypot(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga809de16c6e2c5223c24267ccf2512a99',1,'hypot(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga011392527ff73805d16269b8417e1771',1,'hypot(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga962bb96ce3d106dc7afdaeaef9499b8b',1,'hypot(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ab9da1f27485f833c0c0afce93907d2',1,'hypot(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga293ab0f46540f4becd49692358114c0e',1,'hypot(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5118fa415bd8914cdb981aae79c2a0b2',1,'hypot(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00b1ebd70b412a665918c5266f5ec09d',1,'hypot(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e73831dadab469aa47ed24fa174b9cd',1,'hypot(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f3e69ae032d99664631892884f3f55a',1,'hypot(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c22ee105e405c46e5e7acbdb77d72f7',1,'hypot(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60c8df5704ce0f85f62e4479cf06d031',1,'hypot(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5485aa3b7f159b5acba4efbc4392383c',1,'hypot(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba960bca3a54e7dd3621eebc646af3d7',1,'hypot(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ee9559ae09429b769888252bfbfe4ab',1,'hypot(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5480779c7f1a0e7f5e9d2d7b4d089a76',1,'hypot(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5dbecfe0734bade368f93f6da10649aa',1,'hypot(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a61ebafdaff685afb93927a6e324788',1,'hypot(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08b8090712b081338c8f61bc6faff114',1,'hypot(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab443983069f8d009392505898853d19e',1,'hypot(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc0a537253f3b8e2a9c4442e47abdcc',1,'hypot(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c1eb238c64b78b9569d5f647843a4f5',1,'hypot(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bbe8d2395e710658c1dbafbc1a17980',1,'hypot(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacbaf22ad8cbb046ab3a096504f415d55',1,'hypot(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b6147ad368eee4533098d0961621789',1,'hypot(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga003fe1965f549f6ebe4ceb27e9a7782a',1,'hypot(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80e633d6154d43204c37b7d243c7808a',1,'hypot(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa84447ffe361b8896577711fed43ea29',1,'hypot(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga261cd4cd5ab353536e09b84803c64cc0',1,'hypot(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24e0a3ca9046296a6017b484a409a22a',1,'hypot(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d538f7eb05fdeab85fa59f73f909b40',1,'hypot(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be0d88867e3629d17ed7d709bda3151',1,'hypot(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36f1096e7b4db4cb7fc14abf31a7dc4f',1,'hypot(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae752017a11bc8039a4ee8113e5adb70c',1,'hypot(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8506e061868a9d0b56860b966f119dad',1,'hypot(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f4936864a32235503000102f5e0cb8f',1,'hypot(double s, const double2 &b)(Global Namespace)']]], + ['hypot_5f_629',['hypot_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5667712d8036c43591f7abe1e2b219d0',1,'cv::cudev::hypot_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5667712d8036c43591f7abe1e2b219d0',1,'hypot_()(Global Namespace)']]], + ['hypot_5ffunc_630',['hypot_func',['https://docs.opencv.org/4.2.0/d9/d3e/structcv_1_1cudev_1_1hypot__func.html',1,'cv::cudev']]], + ['hypot_5ffunc_3c_20double_20_3e_631',['hypot_func< double >',['https://docs.opencv.org/4.2.0/d6/d05/structcv_1_1cudev_1_1hypot__func_3_01double_01_4.html',1,'cv::cudev']]], + ['hypot_5ffunc_3c_20float_20_3e_632',['hypot_func< float >',['https://docs.opencv.org/4.2.0/d4/d37/structcv_1_1cudev_1_1hypot__func_3_01float_01_4.html',1,'cv::cudev']]], + ['hypot_5ffunc_3c_20schar_20_3e_633',['hypot_func< schar >',['https://docs.opencv.org/4.2.0/df/dbd/structcv_1_1cudev_1_1hypot__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['hypot_5ffunc_3c_20short_20_3e_634',['hypot_func< short >',['https://docs.opencv.org/4.2.0/dd/d0b/structcv_1_1cudev_1_1hypot__func_3_01short_01_4.html',1,'cv::cudev']]], + ['hypot_5ffunc_3c_20uchar_20_3e_635',['hypot_func< uchar >',['https://docs.opencv.org/4.2.0/d2/db0/structcv_1_1cudev_1_1hypot__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['hypot_5ffunc_3c_20uint_20_3e_636',['hypot_func< uint >',['https://docs.opencv.org/4.2.0/d6/dad/structcv_1_1cudev_1_1hypot__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['hypot_5ffunc_3c_20ushort_20_3e_637',['hypot_func< ushort >',['https://docs.opencv.org/4.2.0/d7/d26/structcv_1_1cudev_1_1hypot__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['hypotnorm_638',['hypotNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a32222d3b6677e6cdf0b801463f329b72',1,'Eigen::MatrixBase::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a32222d3b6677e6cdf0b801463f329b72',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a32222d3b6677e6cdf0b801463f329b72',1,'MatrixBase< Solve< Decomposition, RhsType > >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'Eigen::VectorwiseOp::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const Derived, Horizontal >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const Derived, Vertical >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::hypotNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a00c44e033eec33586ae8093a6366da75',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::hypotNorm()']]] ]; diff --git a/search/all_12.js b/search/all_12.js index 18fc60bd..f4bb30ed 100644 --- a/search/all_12.js +++ b/search/all_12.js @@ -1,7 +1,7 @@ var searchData= [ - ['i_0',['i',['https://docs.opencv.org/4.2.0/dd/d0f/unionCv16suf.html#a99b698f5f5c40c5542c844e595310353',1,'Cv16suf::i'],['https://docs.opencv.org/4.2.0/d9/df3/unionCv32suf.html#a424508ebe407f2e67376ddfca524d16f',1,'Cv32suf::i'],['https://docs.opencv.org/4.2.0/de/d55/unionCv64suf.html#af9bfb67aa19f4eaf8eab3b0ee48784ac',1,'Cv64suf::i'],['https://docs.opencv.org/4.2.0/da/dff/structTHash.html#a925e525d7c839cc562389743c45686d0',1,'THash::i']]], - ['i_1',['I',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a9273ad55d7ee6b78865cc627c59e5890',1,'cv::quality::QualitySSIM::_mat_data']]], + ['i_0',['I',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a9273ad55d7ee6b78865cc627c59e5890',1,'cv::quality::QualitySSIM::_mat_data']]], + ['i_1',['i',['https://docs.opencv.org/4.2.0/dd/d0f/unionCv16suf.html#a99b698f5f5c40c5542c844e595310353',1,'Cv16suf::i'],['https://docs.opencv.org/4.2.0/d9/df3/unionCv32suf.html#a424508ebe407f2e67376ddfca524d16f',1,'Cv32suf::i'],['https://docs.opencv.org/4.2.0/de/d55/unionCv64suf.html#af9bfb67aa19f4eaf8eab3b0ee48784ac',1,'Cv64suf::i'],['https://docs.opencv.org/4.2.0/da/dff/structTHash.html#a925e525d7c839cc562389743c45686d0',1,'THash::i']]], ['i_20o_2',['I O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__c.html',1,'C API for video I/O'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html',1,'Flags for video I/O'],['https://docs.opencv.org/4.2.0/d5/d26/group__videoio__ios.html',1,'iOS glue for video I/O'],['https://docs.opencv.org/4.2.0/d3/d00/tutorial_table_of_content_hdf.html',1,'The Hierarchical Data Format (hdf) I/O'],['https://docs.opencv.org/4.2.0/dd/de7/group__videoio.html',1,'Video I/O'],['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html',1,'WinRT glue for video I/O']]], ['i_20o_20api_20backends_3',['Additional flags for video I/O API backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'']]], ['i_20o_20api_20backends_20registry_4',['Query I/O API backends registry',['https://docs.opencv.org/4.2.0/de/db1/group__videoio__registry.html',1,'']]], @@ -10,8 +10,8 @@ var searchData= ['i_5f2_7',['I_2',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a0e2b01f52b5d8e9b15faf21b3afc0c21',1,'cv::quality::QualitySSIM::_mat_data']]], ['icap_8',['icap',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#ad20c1542d32a3dfef0a083bede8b956a',1,'cv::VideoCapture']]], ['icase_9',['icase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a21c1f7289167aa3d0a40b24e39a80f00',1,'std::regex_constants']]], - ['icosphere_10',['icoSphere',['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html',1,'cv::cnn_3dobj::icoSphere'],['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html#ab2e12fb87c48770db77c66f33ccd043d',1,'cv::cnn_3dobj::icoSphere::icoSphere()']]], - ['icosphere_11',['Training data generation using Icosphere',['https://docs.opencv.org/4.2.0/d6/df4/tutorial_data_generation.html',1,'']]], + ['icosphere_10',['Training data generation using Icosphere',['https://docs.opencv.org/4.2.0/d6/df4/tutorial_data_generation.html',1,'']]], + ['icosphere_11',['icoSphere',['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html',1,'cv::cnn_3dobj::icoSphere'],['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html#ab2e12fb87c48770db77c66f33ccd043d',1,'cv::cnn_3dobj::icoSphere::icoSphere()']]], ['icp_12',['ICP',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1ppf__match__3d_1_1ICP.html',1,'cv::ppf_match_3d::ICP'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1ppf__match__3d_1_1ICP.html#a7290e1a410e32ace65046c4c047c7b7e',1,'cv::ppf_match_3d::ICP::ICP()'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1ppf__match__3d_1_1ICP.html#af0a4a96762f10658963bbfa5f84c3091',1,'cv::ppf_match_3d::ICP::ICP(const int iterations, const float tolerence=0.05f, const float rejectionScale=2.5f, const int numLevels=6, const int sampleType=ICP::ICP_SAMPLING_TYPE_UNIFORM, const int numMaxCorr=1)']]], ['icp_2ehpp_13',['icp.hpp',['https://docs.opencv.org/4.2.0/d3/d94/icp_8hpp.html',1,'']]], ['icp_5fsampling_5ftype_5fgelfand_14',['ICP_SAMPLING_TYPE_GELFAND',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1ppf__match__3d_1_1ICP.html#a4bee200179f879a4fed04aa91cac5990aa3247323abf8483272eadee8a26f7dff',1,'cv::ppf_match_3d::ICP']]], @@ -20,14 +20,14 @@ var searchData= ['icpdistthresh_17',['icpDistThresh',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a812faf37fffed18dbdf03f8e0bca76c3',1,'cv::dynafu::Params::icpDistThresh'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a5678096cbccaa23da5852965aa252996',1,'cv::kinfu::Params::icpDistThresh']]], ['icpiterations_18',['icpIterations',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#ac6aa16994f94c8c73b7c9ac8d5ca22ed',1,'cv::dynafu::Params::icpIterations'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#ad644d8f5f6e13bbcb7cbc4e7f3dbe1c6',1,'cv::kinfu::Params::icpIterations']]], ['icpodometry_19',['ICPOdometry',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html',1,'cv::rgbd::ICPOdometry'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#aa59cec1c3730de5cbba9e34cb4e13572',1,'cv::rgbd::ICPOdometry::ICPOdometry()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a29281fae556d093b553bb72a362a02d3',1,'cv::rgbd::ICPOdometry::ICPOdometry(const Mat &cameraMatrix, float minDepth=Odometry::DEFAULT_MIN_DEPTH(), float maxDepth=Odometry::DEFAULT_MAX_DEPTH(), float maxDepthDiff=Odometry::DEFAULT_MAX_DEPTH_DIFF(), float maxPointsPart=Odometry::DEFAULT_MAX_POINTS_PART(), const std::vector< int > &iterCounts=std::vector< int >(), int transformType=Odometry::RIGID_BODY_MOTION)']]], - ['id_20',['id',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05887.html',1,'std::locale::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02871.html',1,'std::thread::id'],['https://docs.opencv.org/4.2.0/d1/da9/structcv_1_1datasets_1_1AR__hmdbObj.html#ab9e5beef10a2e25808e6c2fe053e5bc5',1,'cv::datasets::AR_hmdbObj::id'],['https://docs.opencv.org/4.2.0/d1/dda/structcv_1_1DetectionBasedTracker_1_1ExtObject.html#ae5e1e82c76d59cbdb2fabf68d1651dd4',1,'cv::DetectionBasedTracker::ExtObject::id'],['https://docs.opencv.org/4.2.0/de/d3f/structcv_1_1datasets_1_1OR__imagenetObj.html#aa0dff410402738924f9afe35ae632b57',1,'cv::datasets::OR_imagenetObj::id'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a9389b8110d67b6f6744689f8541dd328',1,'cv::ppf_match_3d::PoseCluster3D::id'],['https://docs.opencv.org/4.2.0/da/dff/structTHash.html#a31323677edaf6a5e173d84f5c27b4b20',1,'THash::id'],['https://docs.opencv.org/4.2.0/dd/d88/structcv_1_1datasets_1_1TRACK__alovObj.html#af142b8c0e6af19e23b575e2ff4c87320',1,'cv::datasets::TRACK_alovObj::id'],['https://docs.opencv.org/4.2.0/d9/d36/structcv_1_1datasets_1_1TRACK__votObj.html#aed03da34fe11f6bbd75779d8b015a9b3',1,'cv::datasets::TRACK_votObj::id'],['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#adcb303ba903182804bc1f861634a25e1',1,'cv::DetectionBasedTracker::TrackedObject::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ab4a21a6ecff234461ad994da29515d62',1,'std::collate::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ab4a21a6ecff234461ad994da29515d62',1,'std::collate_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#ad9d09c3f3e6b0adc794173ea09adda8b',1,'std::ctype::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aaa75fca18dac7d25648746904feca918',1,'std::ctype< char >::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#ac0eb2ff99c40a189820f9803c63dd088',1,'std::ctype< wchar_t >::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#ad9d09c3f3e6b0adc794173ea09adda8b',1,'std::ctype_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aaa75fca18dac7d25648746904feca918',1,'std::ctype_byname< char >::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#ae38eadfaa98b16a3c80eb033ab26b61e',1,'std::messages::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#ae38eadfaa98b16a3c80eb033ab26b61e',1,'std::messages_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a8ee8d14c2f705adb46d3505008828269',1,'std::money_get::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a2d7912a45d257158197b3ac3a5039d4c',1,'std::money_put::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a317950d8b379f8a1b10105b2bb641f6a',1,'std::moneypunct::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a317950d8b379f8a1b10105b2bb641f6a',1,'std::moneypunct_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a9ba35915bc52e34ce33274bc6c4b3df0',1,'std::num_get::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#acabca6247d4f37a6a82e556da559ebdf',1,'std::num_put::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aa1b5fb7db7f26982b786d4c03fea1367',1,'std::numpunct::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aa1b5fb7db7f26982b786d4c03fea1367',1,'std::numpunct_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a11391168c5b28260580b93009b4c2d23',1,'std::time_get::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a11391168c5b28260580b93009b4c2d23',1,'std::time_get_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#ae2d3eb3e68bdf1e6bf58cb273b41eda4',1,'std::time_put::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#ae2d3eb3e68bdf1e6bf58cb273b41eda4',1,'std::time_put_byname::id'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1GInferBase.html#ab575580f8969c6d0a8aa1484cda791b7',1,'cv::GInferBase::id()'],['https://docs.opencv.org/4.2.0/d2/db8/structcv_1_1GInferListBase.html#afccc980ff27d2b76924d63151eee9f18',1,'cv::GInferListBase::id()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05887.html#a05733d8d1ad35f4fa4feef3313b1bce3',1,'std::locale::id::id()']]], - ['id_21',['ID',['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#aeea2d9545d540097a9d13d76ec58af08',1,'cv::rgbd::RgbdFrame']]], + ['id_20',['ID',['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#aeea2d9545d540097a9d13d76ec58af08',1,'cv::rgbd::RgbdFrame']]], + ['id_21',['id',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05887.html',1,'std::locale::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02871.html',1,'std::thread::id'],['https://docs.opencv.org/4.2.0/d1/da9/structcv_1_1datasets_1_1AR__hmdbObj.html#ab9e5beef10a2e25808e6c2fe053e5bc5',1,'cv::datasets::AR_hmdbObj::id'],['https://docs.opencv.org/4.2.0/d1/dda/structcv_1_1DetectionBasedTracker_1_1ExtObject.html#ae5e1e82c76d59cbdb2fabf68d1651dd4',1,'cv::DetectionBasedTracker::ExtObject::id'],['https://docs.opencv.org/4.2.0/de/d3f/structcv_1_1datasets_1_1OR__imagenetObj.html#aa0dff410402738924f9afe35ae632b57',1,'cv::datasets::OR_imagenetObj::id'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a9389b8110d67b6f6744689f8541dd328',1,'cv::ppf_match_3d::PoseCluster3D::id'],['https://docs.opencv.org/4.2.0/da/dff/structTHash.html#a31323677edaf6a5e173d84f5c27b4b20',1,'THash::id'],['https://docs.opencv.org/4.2.0/dd/d88/structcv_1_1datasets_1_1TRACK__alovObj.html#af142b8c0e6af19e23b575e2ff4c87320',1,'cv::datasets::TRACK_alovObj::id'],['https://docs.opencv.org/4.2.0/d9/d36/structcv_1_1datasets_1_1TRACK__votObj.html#aed03da34fe11f6bbd75779d8b015a9b3',1,'cv::datasets::TRACK_votObj::id'],['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#adcb303ba903182804bc1f861634a25e1',1,'cv::DetectionBasedTracker::TrackedObject::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ab4a21a6ecff234461ad994da29515d62',1,'std::collate::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ab4a21a6ecff234461ad994da29515d62',1,'std::collate_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#ad9d09c3f3e6b0adc794173ea09adda8b',1,'std::ctype::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aaa75fca18dac7d25648746904feca918',1,'std::ctype< char >::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#ac0eb2ff99c40a189820f9803c63dd088',1,'std::ctype< wchar_t >::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#ad9d09c3f3e6b0adc794173ea09adda8b',1,'std::ctype_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aaa75fca18dac7d25648746904feca918',1,'std::ctype_byname< char >::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#ae38eadfaa98b16a3c80eb033ab26b61e',1,'std::messages::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#ae38eadfaa98b16a3c80eb033ab26b61e',1,'std::messages_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a8ee8d14c2f705adb46d3505008828269',1,'std::money_get::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a2d7912a45d257158197b3ac3a5039d4c',1,'std::money_put::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a317950d8b379f8a1b10105b2bb641f6a',1,'std::moneypunct::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a317950d8b379f8a1b10105b2bb641f6a',1,'std::moneypunct_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a9ba35915bc52e34ce33274bc6c4b3df0',1,'std::num_get::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#acabca6247d4f37a6a82e556da559ebdf',1,'std::num_put::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aa1b5fb7db7f26982b786d4c03fea1367',1,'std::numpunct::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aa1b5fb7db7f26982b786d4c03fea1367',1,'std::numpunct_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a11391168c5b28260580b93009b4c2d23',1,'std::time_get::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a11391168c5b28260580b93009b4c2d23',1,'std::time_get_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#ae2d3eb3e68bdf1e6bf58cb273b41eda4',1,'std::time_put::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#ae2d3eb3e68bdf1e6bf58cb273b41eda4',1,'std::time_put_byname::id'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1GInferBase.html#ab575580f8969c6d0a8aa1484cda791b7',1,'cv::GInferBase::id()'],['https://docs.opencv.org/4.2.0/d2/db8/structcv_1_1GInferListBase.html#afccc980ff27d2b76924d63151eee9f18',1,'cv::GInferListBase::id()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05887.html#a05733d8d1ad35f4fa4feef3313b1bce3',1,'std::locale::id::id()']]], ['idct_22',['idct',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga77b168d84e564c50228b69730a227ef2',1,'cv::idct()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga77b168d84e564c50228b69730a227ef2',1,'idct()(Global Namespace)']]], ['idenseoptflowestimator_23',['IDenseOptFlowEstimator',['https://docs.opencv.org/4.2.0/de/d24/classcv_1_1videostab_1_1IDenseOptFlowEstimator.html',1,'cv::videostab']]], ['identify_24',['identify',['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a82348e625eafe407794a4a757168b70d',1,'cv::aruco::Dictionary']]], - ['identity_25',['identity',['https://docs.opencv.org/4.2.0/df/d22/structcv_1_1cudev_1_1identity.html',1,'cv::cudev']]], - ['identity_26',['IDENTITY',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ade71470ec8814021728f8b31b09773b0a5cafa9aa38d3f60f8238e867a4a98e0a',1,'cv::ml::ANN_MLP']]], - ['identity_27',['Identity',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#acf5d919fc383da6777f2f66746ae9466',1,'cv::Affine3::Identity()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#acf5d919fc383da6777f2f66746ae9466',1,'Affine3< float >::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a98bb9a0f705c6dfde85b0bfff31bf88f',1,'Eigen::MatrixBase::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#acf33ce20ef03ead47cb3dbcd5f416ede',1,'Eigen::MatrixBase::Identity(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a98bb9a0f705c6dfde85b0bfff31bf88f',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#acf33ce20ef03ead47cb3dbcd5f416ede',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::Identity(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a98bb9a0f705c6dfde85b0bfff31bf88f',1,'MatrixBase< Solve< Decomposition, RhsType > >::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#acf33ce20ef03ead47cb3dbcd5f416ede',1,'MatrixBase< Solve< Decomposition, RhsType > >::Identity(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a6f31a6f98016f186515b3277f4757962',1,'Eigen::QuaternionBase::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a6f31a6f98016f186515b3277f4757962',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a6f31a6f98016f186515b3277f4757962',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a6f31a6f98016f186515b3277f4757962',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a5897c4cba8d6d19ea8711496fe75836f',1,'Eigen::Transform::Identity()']]], + ['identity_25',['IDENTITY',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ade71470ec8814021728f8b31b09773b0a5cafa9aa38d3f60f8238e867a4a98e0a',1,'cv::ml::ANN_MLP']]], + ['identity_26',['Identity',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#acf5d919fc383da6777f2f66746ae9466',1,'cv::Affine3::Identity()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#acf5d919fc383da6777f2f66746ae9466',1,'Affine3< float >::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a98bb9a0f705c6dfde85b0bfff31bf88f',1,'Eigen::MatrixBase::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#acf33ce20ef03ead47cb3dbcd5f416ede',1,'Eigen::MatrixBase::Identity(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a98bb9a0f705c6dfde85b0bfff31bf88f',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#acf33ce20ef03ead47cb3dbcd5f416ede',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::Identity(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a98bb9a0f705c6dfde85b0bfff31bf88f',1,'MatrixBase< Solve< Decomposition, RhsType > >::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#acf33ce20ef03ead47cb3dbcd5f416ede',1,'MatrixBase< Solve< Decomposition, RhsType > >::Identity(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a6f31a6f98016f186515b3277f4757962',1,'Eigen::QuaternionBase::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a6f31a6f98016f186515b3277f4757962',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a6f31a6f98016f186515b3277f4757962',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a6f31a6f98016f186515b3277f4757962',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::Identity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a5897c4cba8d6d19ea8711496fe75836f',1,'Eigen::Transform::Identity()']]], + ['identity_27',['identity',['https://docs.opencv.org/4.2.0/df/d22/structcv_1_1cudev_1_1identity.html',1,'cv::cudev']]], ['identity_5felement_28',['identity_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gace93b3939a95d95c7f1b010457a54ff9',1,'__gnu_cxx::identity_element(std::plus< _Tp >)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaadbb1d3b3633bdf49a06904e95d5ef79',1,'__gnu_cxx::identity_element(std::multiplies< _Tp >)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gace93b3939a95d95c7f1b010457a54ff9',1,'identity_element(std::plus< _Tp >)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaadbb1d3b3633bdf49a06904e95d5ef79',1,'identity_element(std::multiplies< _Tp >)(Global Namespace)']]], ['identitypreconditioner_29',['IdentityPreconditioner',['https://eigen.tuxfamily.org/dox/classEigen_1_1IdentityPreconditioner.html',1,'Eigen']]], ['idescriptordistance_30',['IDescriptorDistance',['https://docs.opencv.org/4.2.0/d9/dc1/classcv_1_1tbm_1_1IDescriptorDistance.html',1,'cv::tbm']]], @@ -53,881 +53,872 @@ var searchData= ['ilog_50',['ILog',['https://docs.opencv.org/4.2.0/d8/d95/classcv_1_1videostab_1_1ILog.html',1,'cv::videostab']]], ['im_51',['im',['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#a7bdb5493cb787a4e644a51744c5dfbba',1,'cv::Complex']]], ['imag_52',['imag',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a04d60a3c8a266f63c08e03615c1985c9',1,'Eigen']]], - ['image_53',['image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'Binary descriptors for lines extracted from an image'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'Binary morphology on run-length encoded image'],['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'Changing the contrast and brightness of an image!'],['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'Face landmark detection in an image'],['https://docs.opencv.org/4.2.0/df/d0d/tutorial_find_contours.html',1,'Finding contours in your image']]], - ['image_54',['Image',['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html',1,'cv::gapi::wip::draw']]], - ['image_55',['image',['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html#a7ee1a6035004ce7e47cc8e86be65adee',1,'cv::stereo::CensusKernel::image'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#ab7b18cb999c2d1eb89e8ab1009e32c78',1,'cv::stereo::MCTKernel::image'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#a36442396ea4d13a98b9c3214bf899937',1,'cv::stereo::ModifiedCsCensus::image'],['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#ae10b682c0a4e3ae162f0723e23034750',1,'cv::stereo::MVKernel::image'],['https://docs.opencv.org/4.2.0/de/d3f/structcv_1_1datasets_1_1OR__imagenetObj.html#ac87669638322c3241236a4d2d8cb2015',1,'cv::datasets::OR_imagenetObj::image'],['https://docs.opencv.org/4.2.0/d0/d2c/structcv_1_1datasets_1_1OR__mnistObj.html#abee9e6e757f3f4db56fff2c71fe342ec',1,'cv::datasets::OR_mnistObj::image'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#a767de58fc59ade9c29ebf090a01b6317',1,'cv::rgbd::RgbdFrame::image'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a0893985d2dab367baa6e57c6fd0c4956',1,'Eigen::FullPivLU::image()']]], - ['image_56',['Image',['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html#ab9cfd217c05ec962a6f39e685ec05ded',1,'cv::gapi::wip::draw::Image::Image()'],['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'Load and Display an Image'],['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'Load, Modify, and Save an Image']]], - ['image_20and_20channel_20composition_20functions_57',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], - ['image_20blenders_58',['Image Blenders',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html',1,'']]], - ['image_20container_59',['Mat - The Basic Image Container',['https://docs.opencv.org/4.2.0/d6/d6d/tutorial_mat_the_basic_image_container.html',1,'']]], - ['image_20denoising_60',['Image Denoising',['https://docs.opencv.org/4.2.0/d5/d69/tutorial_py_non_local_means.html',1,'']]], - ['image_20file_20reading_20and_20writing_61',['Image file reading and writing',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html',1,'']]], - ['image_20filtering_62',['Image Filtering',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html',1,'Image Filtering'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html',1,'Image Filtering']]], - ['image_20filters_63',['Graph API: Image filters',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html',1,'']]], - ['image_20from_20one_20color_20space_20to_20another_64',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], - ['image_20gradients_65',['Image Gradients',['https://docs.opencv.org/4.2.0/d5/d0f/tutorial_py_gradients.html',1,'Image Gradients'],['https://docs.opencv.org/4.2.0/da/d85/tutorial_js_gradients.html',1,'Image Gradients']]], - ['image_20hashing_20algorithms_66',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], - ['image_20inpainting_67',['Image Inpainting',['https://docs.opencv.org/4.2.0/df/d3d/tutorial_py_inpainting.html',1,'Image Inpainting'],['https://docs.opencv.org/4.2.0/dc/d2f/tutorial_xphoto_inpainting.html',1,'Image Inpainting']]], - ['image_20input_20and_20output_20imgcodecs_20module_68',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], - ['image_20moments_69',['Image Moments',['https://docs.opencv.org/4.2.0/d0/d49/tutorial_moments.html',1,'']]], - ['image_20processing_70',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], - ['image_20processing_71',['Extended Image Processing',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html',1,'']]], - ['image_20processing_72',['Fuzzy image processing',['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html',1,'']]], - ['image_20processing_73',['Image Processing',['https://docs.opencv.org/4.2.0/d7/dbd/group__imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d2/df0/tutorial_js_table_of_contents_imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html',1,'NPPST Image Processing'],['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'OpenCV iOS - Image Processing']]], - ['image_20processing_20based_20on_20fuzzy_20mathematics_74',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], - ['image_20processing_20for_20video_20capture_75',['Image Processing for Video Capture',['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'']]], - ['image_20processing_20functionality_76',['G-API Image processing functionality',['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'']]], - ['image_20processing_20imgproc_20module_77',['Image Processing (imgproc module)',['https://docs.opencv.org/4.2.0/d7/da8/tutorial_table_of_content_imgproc.html',1,'']]], - ['image_20processing_20in_20opencv_78',['Image Processing in OpenCV',['https://docs.opencv.org/4.2.0/d2/d96/tutorial_py_table_of_contents_imgproc.html',1,'']]], - ['image_20processing_20tutorials_79',['Fuzzy image processing tutorials',['https://docs.opencv.org/4.2.0/d7/d36/tutorial_fuzzy.html',1,'']]], - ['image_20pyramids_80',['Image Pyramids',['https://docs.opencv.org/4.2.0/d4/d1f/tutorial_pyramids.html',1,'Image Pyramids'],['https://docs.opencv.org/4.2.0/dc/dff/tutorial_py_pyramids.html',1,'Image Pyramids'],['https://docs.opencv.org/4.2.0/d5/d0f/tutorial_js_pyramids.html',1,'Image Pyramids']]], - ['image_20quality_20analysis_20iqa_20api_81',['Image Quality Analysis (IQA) API',['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'']]], - ['image_20registration_82',['Image Registration',['https://docs.opencv.org/4.2.0/dc/def/group__datasets__ir.html',1,'Image Registration'],['https://docs.opencv.org/4.2.0/db/d61/group__reg.html',1,'Image Registration']]], - ['image_20segmentation_83',['Image Segmentation',['https://docs.opencv.org/4.2.0/dc/d29/group__hfs.html',1,'Hierarchical Feature Selection for Efficient Image Segmentation'],['https://docs.opencv.org/4.2.0/d3/d2d/group__datasets__is.html',1,'Image Segmentation']]], - ['image_20segmentation_84',['Image segmentation',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html',1,'']]], - ['image_20segmentation_20by_20a_20gradient_20structure_20tensor_85',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], - ['image_20segmentation_20on_20g_20api_86',['Porting anisotropic image segmentation on G-API',['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'']]], - ['image_20segmentation_20with_20distance_20transform_20and_20watershed_20algorithm_87',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], - ['image_20segmentation_20with_20watershed_20algorithm_88',['Image Segmentation with Watershed Algorithm',['https://docs.opencv.org/4.2.0/d3/db4/tutorial_py_watershed.html',1,'Image Segmentation with Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d7/d1c/tutorial_js_watershed.html',1,'Image Segmentation with Watershed Algorithm']]], - ['image_20thresholding_89',['Image Thresholding',['https://docs.opencv.org/4.2.0/d7/d4d/tutorial_py_thresholding.html',1,'Image Thresholding'],['https://docs.opencv.org/4.2.0/d7/dd0/tutorial_js_thresholding.html',1,'Image Thresholding']]], - ['image_20transformations_90',['Image Transformations',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html',1,'Geometric Image Transformations'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html',1,'Miscellaneous Image Transformations']]], - ['image_20transforms_20in_20opencv_91',['Image Transforms in OpenCV',['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'']]], - ['image_20transforms_20in_20opencv_20js_92',['Image Transforms in OpenCV.js',['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'']]], - ['image_20warping_93',['Image Warping',['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html',1,'']]], - ['image_20watch_3a_20viewing_20in_20memory_20images_20in_20the_20visual_20studio_20debugger_94',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['image1_95',['image1',['https://docs.opencv.org/4.2.0/d9/d2d/structcv_1_1datasets_1_1FR__lfwObj.html#abb6fe093bd834f81b0cd6d56c5b4e196',1,'cv::datasets::FR_lfwObj']]], - ['image2_96',['image2',['https://docs.opencv.org/4.2.0/d9/d2d/structcv_1_1datasets_1_1FR__lfwObj.html#a5a7bbeaa928253ce0e3bc81b9103e417',1,'cv::datasets::FR_lfwObj']]], - ['image2d_97',['Image2D',['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html',1,'cv::ocl::Image2D'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#aca032d597c124ac6de9fb99651d7dbde',1,'cv::ocl::Image2D::Image2D()'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#add72e2232b399e958dde24794b2ce798',1,'cv::ocl::Image2D::Image2D(const UMat &src, bool norm=false, bool alias=false)'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#a7db0945ce066ef26226773382a177e68',1,'cv::ocl::Image2D::Image2D(const Image2D &i)']]], - ['image2dmaxheight_98',['image2DMaxHeight',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0d604ced5333c5d611b3beae76bb9363',1,'cv::ocl::Device']]], - ['image2dmaxwidth_99',['image2DMaxWidth',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#af6ceb593795e6993dd8da6ae804eae7f',1,'cv::ocl::Device']]], - ['image3dmaxdepth_100',['image3DMaxDepth',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a11ef7435cb679fabecdb34e6d9ea6d4a',1,'cv::ocl::Device']]], - ['image3dmaxheight_101',['image3DMaxHeight',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a6c1b13f92f9455f1c8b6f32fa18457c4',1,'cv::ocl::Device']]], - ['image3dmaxwidth_102',['image3DMaxWidth',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a1af061caf478f15609ce31fa065820dc',1,'cv::ocl::Device']]], - ['image_5fheight_103',['image_height',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a70a6a01ef3e603a76ccacad7d9141894',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['image_5fmanipulation_2emarkdown_104',['image_manipulation.markdown',['https://docs.opencv.org/4.2.0/d6/dd9/image__manipulation_8markdown.html',1,'']]], - ['image_5fwidth_105',['image_width',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#ad402b2464ffeca81b231bad362ce5eb3',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['imagebaseaddressalignment_106',['imageBaseAddressAlignment',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ac2a1da702ac445d6fcfb3fcba6d8f2fa',1,'cv::ocl::Device']]], - ['imagefeatures_107',['ImageFeatures',['https://docs.opencv.org/4.2.0/d4/db5/structcv_1_1detail_1_1ImageFeatures.html',1,'cv::detail']]], - ['imagefrombuffersupport_108',['imageFromBufferSupport',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ad62349c834402cce5d669f96147cf1da',1,'cv::ocl::Device']]], - ['imageheight_109',['imageHeight',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html#aabe73045bfa26b6b9564f50f2ad8e926',1,'cv::datasets::cameraParam::imageHeight'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a3aeba5c58aa31e3fc1b61819646d3b85',1,'CvAbstractCamera::imageHeight']]], - ['imagemaxarraysize_110',['imageMaxArraySize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a28a636515d6d600ba73566ffc88deabc',1,'cv::ocl::Device']]], - ['imagemaxbuffersize_111',['imageMaxBufferSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ae8affe34b8862e78ce89d2fcf7c2c6c2',1,'cv::ocl::Device']]], - ['imagemeankernelsize_112',['imageMeanKernelSize',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a04c8fb11c40d6a9885dfa3f3a2012699',1,'cv::stereo']]], - ['imagemotionestimatorbase_113',['ImageMotionEstimatorBase',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html',1,'cv::videostab::ImageMotionEstimatorBase'],['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html#a57edcbe22bc6b8aefd80ea7de0f2a2a8',1,'cv::videostab::ImageMotionEstimatorBase::ImageMotionEstimatorBase()']]], - ['imagename_114',['imageName',['https://docs.opencv.org/4.2.0/d9/dff/structcv_1_1datasets_1_1IR__affineObj.html#a5e7c316ff2b58e6df6c81df421f37d75',1,'cv::datasets::IR_affineObj::imageName'],['https://docs.opencv.org/4.2.0/d8/d65/structcv_1_1datasets_1_1IS__weizmannObj.html#ae5b458a3d24032c463fb0bb7060c041b',1,'cv::datasets::IS_weizmannObj::imageName'],['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html#acc4e0ae734d4daedd1764f577fb7aa3a',1,'cv::datasets::MSM_epflObj::imageName'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1datasets_1_1MSM__middleburyObj.html#a9ebf5ae5b618ff7a1ac72cde7f8e7027',1,'cv::datasets::MSM_middleburyObj::imageName'],['https://docs.opencv.org/4.2.0/dc/d1e/structcv_1_1datasets_1_1SR__bsdsObj.html#a18fe7840effc15b4c02eeb3cc7aeb43d',1,'cv::datasets::SR_bsdsObj::imageName'],['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1datasets_1_1SR__div2kObj.html#afe31c65e4dad1adc430b8180a3610ec9',1,'cv::datasets::SR_div2kObj::imageName'],['https://docs.opencv.org/4.2.0/da/dad/structcv_1_1datasets_1_1SR__general100Obj.html#a4188b3afa218140e93fe37cd6863c97f',1,'cv::datasets::SR_general100Obj::imageName']]], - ['imagenames_115',['imageNames',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#ace1275a3bdec76f6f006ca7b6b11cad7',1,'cv::datasets::HPE_humanevaObj::imageNames'],['https://docs.opencv.org/4.2.0/dd/ded/structcv_1_1datasets_1_1PD__caltechObj.html#ab45cfe4e0b04e8abcb91f541a10d33da',1,'cv::datasets::PD_caltechObj::imageNames']]], - ['imagepath_116',['imagePath',['https://docs.opencv.org/4.2.0/dd/d88/structcv_1_1datasets_1_1TRACK__alovObj.html#a8ba7c5780895da2eeb126dc6f9f229fd',1,'cv::datasets::TRACK_alovObj::imagePath'],['https://docs.opencv.org/4.2.0/d9/d36/structcv_1_1datasets_1_1TRACK__votObj.html#a5b071a222aa3d9058bdc20cf1cf08771',1,'cv::datasets::TRACK_votObj::imagePath']]], - ['imagepitchalignment_117',['imagePitchAlignment',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a909d421e167958dd1113a91d160f406f',1,'cv::ocl::Device']]], - ['imagepyramid_118',['ImagePyramid',['https://docs.opencv.org/4.2.0/d2/d77/classcv_1_1cuda_1_1ImagePyramid.html',1,'cv::cuda']]], - ['images_119',['Adding borders to your images',['https://docs.opencv.org/4.2.0/dc/da3/tutorial_copyMakeBorder.html',1,'']]], - ['images_120',['Images',['https://docs.opencv.org/4.2.0/d0/d86/tutorial_py_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/d3/df2/tutorial_py_basic_ops.html',1,'Basic Operations on Images'],['https://docs.opencv.org/4.2.0/de/d06/tutorial_js_basic_ops.html',1,'Basic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d53/tutorial_py_depthmap.html',1,'Depth Map from Stereo Images'],['https://docs.opencv.org/4.2.0/da/d6e/tutorial_py_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dd/d52/tutorial_js_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dc/d2e/tutorial_py_image_display.html',1,'Getting Started with Images'],['https://docs.opencv.org/4.2.0/df/d24/tutorial_js_image_display.html',1,'Getting Started with Images']]], - ['images_121',['images',['https://docs.opencv.org/4.2.0/d1/d64/structcv_1_1datasets_1_1cameraPos.html#ad8a7cbe833f22c59cbaa12af0320ec40',1,'cv::datasets::cameraPos::images'],['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html#a76b07b4517571cc5a3f2fafa4a4a409e',1,'cv::datasets::SLAM_kittiObj::images'],['https://docs.opencv.org/4.2.0/d5/d98/tutorial_mat_operations.html',1,'Operations with images']]], - ['images_122',['Images',['https://docs.opencv.org/4.2.0/dc/dd3/tutorial_gausian_median_blur_bilateral_filter.html',1,'Smoothing Images'],['https://docs.opencv.org/4.2.0/d4/d13/tutorial_py_filtering.html',1,'Smoothing Images'],['https://docs.opencv.org/4.2.0/dd/d6a/tutorial_js_filtering.html',1,'Smoothing Images']]], - ['images_20causing_20optical_20illusions_123',['Processing images causing optical illusions',['https://docs.opencv.org/4.2.0/d7/d8f/tutorial_bioinspired_retina_illusion.html',1,'']]], - ['images_20in_20the_20visual_20studio_20debugger_124',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_125',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], - ['images_20matching_126',['Features Finding and Images Matching',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'']]], - ['images_20stitching_127',['Images stitching',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html',1,'']]], - ['images_20stitching_20stitching_20module_128',['Images stitching (stitching module)',['https://docs.opencv.org/4.2.0/d0/d33/tutorial_table_of_content_stitching.html',1,'']]], - ['images_20using_20opencv_129',['Adding (blending) two images using OpenCV',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_adding_images.html',1,'']]], - ['images_20warping_130',['Images Warping',['https://docs.opencv.org/4.2.0/d0/dfa/group__stitching__warp.html',1,'']]], - ['images_3a_20multi_20output_131',['Upscaling images: multi-output',['https://docs.opencv.org/4.2.0/d6/dca/tutorial_dnn_superres_upscale_image_multi.html',1,'']]], - ['images_3a_20single_20output_132',['Upscaling images: single-output',['https://docs.opencv.org/4.2.0/d5/d29/tutorial_dnn_superres_upscale_image_single.html',1,'']]], - ['images_5f_133',['images_',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a681e67ac1e0b06c5b4d7ef15fc5eb0b0',1,'cv::detail::PairwiseSeamFinder']]], - ['imagesfromblob_134',['imagesFromBlob',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga4051b5fa2ed5f54b76c059a8625df9f5',1,'cv::dnn::imagesFromBlob()'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga4051b5fa2ed5f54b76c059a8625df9f5',1,'imagesFromBlob()(Global Namespace)']]], - ['imagestop_135',['imageStop',['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html#a450f0ca8718251bd6543912e7d183c92',1,'cv::stereo::CensusKernel::imageStop'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a17333f338a128b7f2a8513cf6f13a093',1,'cv::stereo::MCTKernel::imageStop'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#af9d600b3f05c0831718c495a5c7bf4af',1,'cv::stereo::ModifiedCsCensus::imageStop']]], - ['imagesupport_136',['imageSupport',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0fbeab8f04dfce8a23eb2b5ad01ffbce',1,'cv::ocl::Device']]], - ['imagetype_137',['imageType',['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#ga4d28f23013f06ead1ded84a16d514805',1,'cv::datasets::imageType'],['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#ga4d28f23013f06ead1ded84a16d514805',1,'imageType(Global Namespace)']]], - ['imagewidth_138',['imageWidth',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html#aa6eb6d891582b1815e5190624f9ebd3a',1,'cv::datasets::cameraParam::imageWidth'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a9ce69702c4608e60386884e5f7c233cf',1,'CvAbstractCamera::imageWidth']]], - ['imaging_139',['HDR imaging',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html',1,'']]], - ['imaging_140',['High Dynamic Range Imaging',['https://docs.opencv.org/4.2.0/d3/db7/tutorial_hdr_imaging.html',1,'']]], - ['imbue_141',['imbue',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'__gnu_cxx::enc_filebuf::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'__gnu_cxx::stdio_filebuf::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'__gnu_cxx::stdio_sync_filebuf::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'basic_filebuf< char_type, traits_type >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'basic_ios< char, _Traits >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'basic_iostream< char >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'basic_istream< char >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'basic_istream< char, _Traits >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'basic_ostream< char >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'basic_ostream< char, _Traits >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'basic_streambuf< _Elem, _Tr >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'basic_streambuf< char, _Traits >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'basic_streambuf< char, char_traits< char > >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ae1d71eed7ede0411f443426e1d0b781d',1,'regex_traits< _CharType >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'std::basic_filebuf::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_fstream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_ifstream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_ios::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_iostream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_istream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_istringstream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_ofstream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_ostream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_ostringstream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a47e4d0a05a45fc95da8c061c33789004',1,'std::basic_regex::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'std::basic_streambuf::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'std::basic_stringbuf::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_stringstream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a29b144ecf437562b7cc05027f3e5a608',1,'std::ios_base::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ae1d71eed7ede0411f443426e1d0b781d',1,'std::regex_traits::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'std::wbuffer_convert::imbue()']]], - ['imdecode_142',['imdecode',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga26a67788faa58ade337f8d28ba0eb19e',1,'cv::imdecode(InputArray buf, int flags)'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga5a0acefe5cbe0a81e904e452ec7ca733',1,'cv::imdecode(InputArray buf, int flags, Mat *dst)'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga26a67788faa58ade337f8d28ba0eb19e',1,'imdecode(InputArray buf, int flags)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga5a0acefe5cbe0a81e904e452ec7ca733',1,'imdecode(InputArray buf, int flags, Mat *dst)(Global Namespace)']]], - ['imencode_143',['imencode',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga461f9ac09887e47797a54567df3b8b63',1,'cv::imencode()'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga461f9ac09887e47797a54567df3b8b63',1,'imencode()(Global Namespace)']]], - ['img_144',['img',['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html#aff97be87fcbce5f77a0a4920233c38ca',1,'cv::gapi::wip::draw::Image']]], - ['img_5fhash_2ehpp_145',['img_hash.hpp',['https://docs.opencv.org/4.2.0/d4/d59/img__hash_8hpp.html',1,'']]], - ['img_5fhash_5fbase_2ehpp_146',['img_hash_base.hpp',['https://docs.opencv.org/4.2.0/d9/db6/img__hash__base_8hpp.html',1,'']]], - ['img_5fidx_147',['img_idx',['https://docs.opencv.org/4.2.0/d4/db5/structcv_1_1detail_1_1ImageFeatures.html#a323db3650a49ac613aa22e5847d11402',1,'cv::detail::ImageFeatures']]], - ['img_5fsize_148',['img_size',['https://docs.opencv.org/4.2.0/d4/db5/structcv_1_1detail_1_1ImageFeatures.html#a7a1bb046a17262f873efd09fa990b327',1,'cv::detail::ImageFeatures']]], - ['imgcodecs_20module_149',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], - ['imgcodecs_2ehpp_150',['imgcodecs.hpp',['https://docs.opencv.org/4.2.0/d7/dd8/imgcodecs_2imgcodecs_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d87/imgcodecs_8hpp.html',1,'(Global Namespace)']]], - ['imghashbase_151',['ImgHashBase',['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1img__hash_1_1ImgHashBase.html',1,'cv::img_hash::ImgHashBase'],['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1img__hash_1_1ImgHashBase.html#acd86138597f1679b8ffb7a730a68761c',1,'cv::img_hash::ImgHashBase::ImgHashBase()']]], - ['imgidx_152',['imgIdx',['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#ab9800c265dcb748a28aa1a2d4b45eea4',1,'cv::DMatch']]], - ['imgname_153',['imgName',['https://docs.opencv.org/4.2.0/d8/d14/structcv_1_1datasets_1_1TR__charsObj.html#aa43d91bb6efa68b2f12df537c7a32338',1,'cv::datasets::TR_charsObj']]], - ['imgproc_20module_154',['Image Processing (imgproc module)',['https://docs.opencv.org/4.2.0/d7/da8/tutorial_table_of_content_imgproc.html',1,'']]], - ['imgproc_2ehpp_155',['imgproc.hpp',['https://docs.opencv.org/4.2.0/dd/d01/imgproc_2include_2opencv2_2imgproc_2imgproc_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d4f/imgproc_2include_2opencv2_2imgproc_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d08/gapi_2include_2opencv2_2gapi_2cpu_2imgproc_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/da0/gapi_2include_2opencv2_2gapi_2fluid_2imgproc_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d8e/gapi_2include_2opencv2_2gapi_2gpu_2imgproc_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d75/gapi_2include_2opencv2_2gapi_2imgproc_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/dca/gapi_2include_2opencv2_2gapi_2ocl_2imgproc_8hpp.html',1,'(Global Namespace)']]], - ['immediate_5frendering_156',['IMMEDIATE_RENDERING',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca0e49c2cab4dc09a7c4b923fcd552142a',1,'cv::viz::IMMEDIATE_RENDERING'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca0e49c2cab4dc09a7c4b923fcd552142a',1,'IMMEDIATE_RENDERING(Global Namespace)']]], - ['imotionstabilizer_157',['IMotionStabilizer',['https://docs.opencv.org/4.2.0/d0/df6/classcv_1_1videostab_1_1IMotionStabilizer.html',1,'cv::videostab']]], - ['impl_158',['Impl',['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#a28f9208c375f8929eed44ac72398978b',1,'cv::AsyncPromise::Impl'],['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#aee24c43b9029c5fba6fb8747c948c0da',1,'cv::AsyncArray::Impl'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#aee24c43b9029c5fba6fb8747c948c0da',1,'cv::ocl::Program::Impl'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#aee24c43b9029c5fba6fb8747c948c0da',1,'cv::ocl::ProgramSource::Impl'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#aee24c43b9029c5fba6fb8747c948c0da',1,'cv::ocl::Queue::Impl']]], - ['impl_159',['impl',['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#a4f1f41fd43c10f0fd10e631f5dc60b6c',1,'cv::CommandLineParser::impl'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#ac85bd692412a11f32f2041d7eedbc809',1,'cv::dnn::Model::impl']]], - ['impl_160',['IMPL',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a9b77a9e0a5f5e66564a1a39c87903178',1,'cv::instr']]], - ['impl_5f_161',['impl_',['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#a9e6b74e94d69e18705e961fe753c45c4',1,'cv::detail::BestOf2NearestMatcher']]], - ['impl_5fipp_162',['IMPL_IPP',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a9b77a9e0a5f5e66564a1a39c87903178a2dae30c2ae75ed684f0d51130fedcf9c',1,'cv::instr']]], - ['impl_5fopencl_163',['IMPL_OPENCL',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a9b77a9e0a5f5e66564a1a39c87903178a28151a2fbfc313cc38dab21d1c878e56',1,'cv::instr']]], - ['impl_5fplain_164',['IMPL_PLAIN',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a9b77a9e0a5f5e66564a1a39c87903178a856b5bd29129dc9ce32254688e2519d4',1,'cv::instr']]], - ['implementation_20classes_165',['Implementation Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01501.html',1,'Base and Implementation Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01497.html',1,'Base and Implementation Classes']]], - ['implementation_20details_166',['Implementation details',['https://docs.opencv.org/4.2.0/d4/ddd/gapi_impl.html',1,'']]], - ['implementation_20helpers_167',['Private implementation helpers',['https://docs.opencv.org/4.2.0/dd/d96/group__core__hal__intrin__impl.html',1,'']]], - ['implementations_20of_20different_20image_20hashing_20algorithms_168',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], - ['implemented_20layers_169',['Partial List of Implemented Layers',['https://docs.opencv.org/4.2.0/d6/d87/group__dnnLayerList.html',1,'']]], - ['implementing_20a_20face_20beautification_20algorithm_20with_20g_20api_170',['Implementing a face beautification algorithm with G-API',['https://docs.opencv.org/4.2.0/d4/d48/tutorial_gapi_face_beautification.html',1,'']]], - ['import_20reconstruction_171',['Import Reconstruction',['https://docs.opencv.org/4.2.0/de/dfd/tutorial_sfm_import_reconstruction.html',1,'']]], - ['importreconstruction_172',['importReconstruction',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ga10a93a70917b83ac7929f7cc40e5365b',1,'cv::sfm::importReconstruction()'],['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ga10a93a70917b83ac7929f7cc40e5365b',1,'importReconstruction(const cv::String &file, OutputArrayOfArrays Rs, OutputArrayOfArrays Ts, OutputArrayOfArrays Ks, OutputArrayOfArrays points3d, int file_format=SFM_IO_BUNDLER)(Global Namespace)']]], - ['improve_20efficiency_173',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], - ['improved_20background_20foreground_20segmentation_20methods_174',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], - ['improvement_20techniques_175',['Performance Measurement and Improvement Techniques',['https://docs.opencv.org/4.2.0/dc/d71/tutorial_py_optimization.html',1,'']]], - ['imread_176',['imread',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga288b8b3da0892bd651fce07b3bbd3a56',1,'cv::imread()'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga288b8b3da0892bd651fce07b3bbd3a56',1,'imread()(Global Namespace)']]], - ['imread_5fanycolor_177',['IMREAD_ANYCOLOR',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80ab6573b69300c092b61800222fe555953',1,'cv::IMREAD_ANYCOLOR'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80ab6573b69300c092b61800222fe555953',1,'IMREAD_ANYCOLOR(Global Namespace)']]], - ['imread_5fanydepth_178',['IMREAD_ANYDEPTH',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a0b486c93c25e8a0b0712681bb7254c18',1,'cv::IMREAD_ANYDEPTH'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a0b486c93c25e8a0b0712681bb7254c18',1,'IMREAD_ANYDEPTH(Global Namespace)']]], - ['imread_5fcolor_179',['IMREAD_COLOR',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80af660544735200cbe942eea09232eb822',1,'cv::IMREAD_COLOR'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80af660544735200cbe942eea09232eb822',1,'IMREAD_COLOR(Global Namespace)']]], - ['imread_5fgrayscale_180',['IMREAD_GRAYSCALE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80ae29981cfc153d3b0cef5c0daeedd2125',1,'cv::IMREAD_GRAYSCALE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80ae29981cfc153d3b0cef5c0daeedd2125',1,'IMREAD_GRAYSCALE(Global Namespace)']]], - ['imread_5fignore_5forientation_181',['IMREAD_IGNORE_ORIENTATION',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a34f91a514cd95127d8ba900840af548e',1,'cv::IMREAD_IGNORE_ORIENTATION'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a34f91a514cd95127d8ba900840af548e',1,'IMREAD_IGNORE_ORIENTATION(Global Namespace)']]], - ['imread_5fload_5fgdal_182',['IMREAD_LOAD_GDAL',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a1b482916f4ffe34f0b90550f267fd896',1,'cv::IMREAD_LOAD_GDAL'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a1b482916f4ffe34f0b90550f267fd896',1,'IMREAD_LOAD_GDAL(Global Namespace)']]], - ['imread_5freduced_5fcolor_5f2_183',['IMREAD_REDUCED_COLOR_2',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a4d3de7230e2682195e09b00728792b37',1,'cv::IMREAD_REDUCED_COLOR_2'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a4d3de7230e2682195e09b00728792b37',1,'IMREAD_REDUCED_COLOR_2(Global Namespace)']]], - ['imread_5freduced_5fcolor_5f4_184',['IMREAD_REDUCED_COLOR_4',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80adf4fbfe43fb7c8c94ca008e7d7d20086',1,'cv::IMREAD_REDUCED_COLOR_4'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80adf4fbfe43fb7c8c94ca008e7d7d20086',1,'IMREAD_REDUCED_COLOR_4(Global Namespace)']]], - ['imread_5freduced_5fcolor_5f8_185',['IMREAD_REDUCED_COLOR_8',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80ac865811dba56b17a8241f9e62c273198',1,'cv::IMREAD_REDUCED_COLOR_8'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80ac865811dba56b17a8241f9e62c273198',1,'IMREAD_REDUCED_COLOR_8(Global Namespace)']]], - ['imread_5freduced_5fgrayscale_5f2_186',['IMREAD_REDUCED_GRAYSCALE_2',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a64063c4e6a917237bd2daef7aa23dc01',1,'cv::IMREAD_REDUCED_GRAYSCALE_2'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a64063c4e6a917237bd2daef7aa23dc01',1,'IMREAD_REDUCED_GRAYSCALE_2(Global Namespace)']]], - ['imread_5freduced_5fgrayscale_5f4_187',['IMREAD_REDUCED_GRAYSCALE_4',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a7903236181de9ade28ba1438b342e6c8',1,'cv::IMREAD_REDUCED_GRAYSCALE_4'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a7903236181de9ade28ba1438b342e6c8',1,'IMREAD_REDUCED_GRAYSCALE_4(Global Namespace)']]], - ['imread_5freduced_5fgrayscale_5f8_188',['IMREAD_REDUCED_GRAYSCALE_8',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a838097893b5d5385d43e6a4470227a33',1,'cv::IMREAD_REDUCED_GRAYSCALE_8'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a838097893b5d5385d43e6a4470227a33',1,'IMREAD_REDUCED_GRAYSCALE_8(Global Namespace)']]], - ['imread_5funchanged_189',['IMREAD_UNCHANGED',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80aeddd67043ed0df14f9d9a4e66d2b0708',1,'cv::IMREAD_UNCHANGED'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80aeddd67043ed0df14f9d9a4e66d2b0708',1,'IMREAD_UNCHANGED(Global Namespace)']]], - ['imreadmodes_190',['ImreadModes',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga61d9b0126a3e57d9277ac48327799c80',1,'cv::ImreadModes'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga61d9b0126a3e57d9277ac48327799c80',1,'ImreadModes(Global Namespace)']]], - ['imreadmulti_191',['imreadmulti',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga4dd47c9ae3d55cc42286cff005825e31',1,'cv::imreadmulti()'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga4dd47c9ae3d55cc42286cff005825e31',1,'imreadmulti()(Global Namespace)']]], - ['imshow_192',['imshow',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga453d42fe4cb60e5723281a89973ee563',1,'cv::imshow(const String &winname, InputArray mat)'],['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html#gaae7e90aa3415c68dba22a5ff2cefc25d',1,'cv::imshow(const String &winname, const ogl::Texture2D &tex)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga1a852143d72014de60067bf3e46faec0',1,'cv::viz::imshow()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga453d42fe4cb60e5723281a89973ee563',1,'imshow(const String &winname, InputArray mat)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html#gaae7e90aa3415c68dba22a5ff2cefc25d',1,'imshow(const String &winname, const ogl::Texture2D &tex)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga1a852143d72014de60067bf3e46faec0',1,'imshow(const String &window_name, InputArray image, const Size &window_size=Size(-1, -1))(Global Namespace)']]], - ['imwrite_193',['imwrite',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gabbc7ef1aa2edfaa87772f1202d67e0ce',1,'cv::imwrite()'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gabbc7ef1aa2edfaa87772f1202d67e0ce',1,'imwrite()(Global Namespace)']]], - ['imwrite_5fexr_5ftype_194',['IMWRITE_EXR_TYPE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca4aed00547168d3a1083a2b1241b99102',1,'cv::IMWRITE_EXR_TYPE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca4aed00547168d3a1083a2b1241b99102',1,'IMWRITE_EXR_TYPE(Global Namespace)']]], - ['imwrite_5fexr_5ftype_5ffloat_195',['IMWRITE_EXR_TYPE_FLOAT',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga47d07d14b3c33151daac7fde6f34e897ad6a009ca0724b2e8bcbe0b60f395f2c7',1,'cv::IMWRITE_EXR_TYPE_FLOAT'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga47d07d14b3c33151daac7fde6f34e897ad6a009ca0724b2e8bcbe0b60f395f2c7',1,'IMWRITE_EXR_TYPE_FLOAT(Global Namespace)']]], - ['imwrite_5fexr_5ftype_5fhalf_196',['IMWRITE_EXR_TYPE_HALF',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga47d07d14b3c33151daac7fde6f34e897a15ef5fdee6e2a55b4d0a1f9b2874fb96',1,'cv::IMWRITE_EXR_TYPE_HALF'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga47d07d14b3c33151daac7fde6f34e897a15ef5fdee6e2a55b4d0a1f9b2874fb96',1,'IMWRITE_EXR_TYPE_HALF(Global Namespace)']]], - ['imwrite_5fjpeg2000_5fcompression_5fx1000_197',['IMWRITE_JPEG2000_COMPRESSION_X1000',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaa082190a50748f712a6384416c2524dd',1,'cv::IMWRITE_JPEG2000_COMPRESSION_X1000'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaa082190a50748f712a6384416c2524dd',1,'IMWRITE_JPEG2000_COMPRESSION_X1000(Global Namespace)']]], - ['imwrite_5fjpeg_5fchroma_5fquality_198',['IMWRITE_JPEG_CHROMA_QUALITY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaaba13094b3575e78a6002788b0ae7354',1,'cv::IMWRITE_JPEG_CHROMA_QUALITY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaaba13094b3575e78a6002788b0ae7354',1,'IMWRITE_JPEG_CHROMA_QUALITY(Global Namespace)']]], - ['imwrite_5fjpeg_5fluma_5fquality_199',['IMWRITE_JPEG_LUMA_QUALITY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca64c65da14d74ab87143d6999c4df12ea',1,'cv::IMWRITE_JPEG_LUMA_QUALITY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca64c65da14d74ab87143d6999c4df12ea',1,'IMWRITE_JPEG_LUMA_QUALITY(Global Namespace)']]], - ['imwrite_5fjpeg_5foptimize_200',['IMWRITE_JPEG_OPTIMIZE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acae80c3e72393ec86b8ea1db4a2a228b5f',1,'cv::IMWRITE_JPEG_OPTIMIZE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acae80c3e72393ec86b8ea1db4a2a228b5f',1,'IMWRITE_JPEG_OPTIMIZE(Global Namespace)']]], - ['imwrite_5fjpeg_5fprogressive_201',['IMWRITE_JPEG_PROGRESSIVE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca32ab52a075fc4e2ca23760a80b3fcd12',1,'cv::IMWRITE_JPEG_PROGRESSIVE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca32ab52a075fc4e2ca23760a80b3fcd12',1,'IMWRITE_JPEG_PROGRESSIVE(Global Namespace)']]], - ['imwrite_5fjpeg_5fquality_202',['IMWRITE_JPEG_QUALITY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca947af22db2cf6f1f482289b0985b09ec',1,'cv::IMWRITE_JPEG_QUALITY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca947af22db2cf6f1f482289b0985b09ec',1,'IMWRITE_JPEG_QUALITY(Global Namespace)']]], - ['imwrite_5fjpeg_5frst_5finterval_203',['IMWRITE_JPEG_RST_INTERVAL',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca06f325a56b6b09074d9781de18745560',1,'cv::IMWRITE_JPEG_RST_INTERVAL'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca06f325a56b6b09074d9781de18745560',1,'IMWRITE_JPEG_RST_INTERVAL(Global Namespace)']]], - ['imwrite_5fpam_5fformat_5fblackandwhite_204',['IMWRITE_PAM_FORMAT_BLACKANDWHITE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a32a5eb9e6aa378ef126a6ec29c710d15',1,'cv::IMWRITE_PAM_FORMAT_BLACKANDWHITE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a32a5eb9e6aa378ef126a6ec29c710d15',1,'IMWRITE_PAM_FORMAT_BLACKANDWHITE(Global Namespace)']]], - ['imwrite_5fpam_5fformat_5fgrayscale_205',['IMWRITE_PAM_FORMAT_GRAYSCALE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a9f2122f919b87bd6f5209ebe3673478d',1,'cv::IMWRITE_PAM_FORMAT_GRAYSCALE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a9f2122f919b87bd6f5209ebe3673478d',1,'IMWRITE_PAM_FORMAT_GRAYSCALE(Global Namespace)']]], - ['imwrite_5fpam_5fformat_5fgrayscale_5falpha_206',['IMWRITE_PAM_FORMAT_GRAYSCALE_ALPHA',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a31754d8e503b394996982d8eeb5916b5',1,'cv::IMWRITE_PAM_FORMAT_GRAYSCALE_ALPHA'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a31754d8e503b394996982d8eeb5916b5',1,'IMWRITE_PAM_FORMAT_GRAYSCALE_ALPHA(Global Namespace)']]], - ['imwrite_5fpam_5fformat_5fnull_207',['IMWRITE_PAM_FORMAT_NULL',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a05708faa19fda2b0e3e793542fced3c9',1,'cv::IMWRITE_PAM_FORMAT_NULL'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a05708faa19fda2b0e3e793542fced3c9',1,'IMWRITE_PAM_FORMAT_NULL(Global Namespace)']]], - ['imwrite_5fpam_5fformat_5frgb_208',['IMWRITE_PAM_FORMAT_RGB',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a749f4c5db48aa048ae4dbd8670d7d58d',1,'cv::IMWRITE_PAM_FORMAT_RGB'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a749f4c5db48aa048ae4dbd8670d7d58d',1,'IMWRITE_PAM_FORMAT_RGB(Global Namespace)']]], - ['imwrite_5fpam_5fformat_5frgb_5falpha_209',['IMWRITE_PAM_FORMAT_RGB_ALPHA',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01adfdc63fecaa2abcbe1d98b79030c726a',1,'cv::IMWRITE_PAM_FORMAT_RGB_ALPHA'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01adfdc63fecaa2abcbe1d98b79030c726a',1,'IMWRITE_PAM_FORMAT_RGB_ALPHA(Global Namespace)']]], - ['imwrite_5fpam_5ftupletype_210',['IMWRITE_PAM_TUPLETYPE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acacc7bb2ed1314ec9278a38d85e83b6623',1,'cv::IMWRITE_PAM_TUPLETYPE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acacc7bb2ed1314ec9278a38d85e83b6623',1,'IMWRITE_PAM_TUPLETYPE(Global Namespace)']]], - ['imwrite_5fpng_5fbilevel_211',['IMWRITE_PNG_BILEVEL',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca8c609ad94b7bd036ef68c51e7f77915f',1,'cv::IMWRITE_PNG_BILEVEL'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca8c609ad94b7bd036ef68c51e7f77915f',1,'IMWRITE_PNG_BILEVEL(Global Namespace)']]], - ['imwrite_5fpng_5fcompression_212',['IMWRITE_PNG_COMPRESSION',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acad2548321c69ab9c0582fd51e75ace1d0',1,'cv::IMWRITE_PNG_COMPRESSION'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acad2548321c69ab9c0582fd51e75ace1d0',1,'IMWRITE_PNG_COMPRESSION(Global Namespace)']]], - ['imwrite_5fpng_5fstrategy_213',['IMWRITE_PNG_STRATEGY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaa95faec46150b372c80c7d4bbedbcf8a',1,'cv::IMWRITE_PNG_STRATEGY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaa95faec46150b372c80c7d4bbedbcf8a',1,'IMWRITE_PNG_STRATEGY(Global Namespace)']]], - ['imwrite_5fpng_5fstrategy_5fdefault_214',['IMWRITE_PNG_STRATEGY_DEFAULT',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a5bb296ccb3fab45a113a1cc28bf43abf',1,'cv::IMWRITE_PNG_STRATEGY_DEFAULT'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a5bb296ccb3fab45a113a1cc28bf43abf',1,'IMWRITE_PNG_STRATEGY_DEFAULT(Global Namespace)']]], - ['imwrite_5fpng_5fstrategy_5ffiltered_215',['IMWRITE_PNG_STRATEGY_FILTERED',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a3def1a542d499f4f05c19efab9d79292',1,'cv::IMWRITE_PNG_STRATEGY_FILTERED'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a3def1a542d499f4f05c19efab9d79292',1,'IMWRITE_PNG_STRATEGY_FILTERED(Global Namespace)']]], - ['imwrite_5fpng_5fstrategy_5ffixed_216',['IMWRITE_PNG_STRATEGY_FIXED',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a4663acb92a49bb13104a2769cee7d0c8',1,'cv::IMWRITE_PNG_STRATEGY_FIXED'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a4663acb92a49bb13104a2769cee7d0c8',1,'IMWRITE_PNG_STRATEGY_FIXED(Global Namespace)']]], - ['imwrite_5fpng_5fstrategy_5fhuffman_5fonly_217',['IMWRITE_PNG_STRATEGY_HUFFMAN_ONLY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9affed3ef30c9147769361546cf0b5ad5a',1,'cv::IMWRITE_PNG_STRATEGY_HUFFMAN_ONLY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9affed3ef30c9147769361546cf0b5ad5a',1,'IMWRITE_PNG_STRATEGY_HUFFMAN_ONLY(Global Namespace)']]], - ['imwrite_5fpng_5fstrategy_5frle_218',['IMWRITE_PNG_STRATEGY_RLE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a5d75e74ce7cdaf0139f1d44d23734b43',1,'cv::IMWRITE_PNG_STRATEGY_RLE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a5d75e74ce7cdaf0139f1d44d23734b43',1,'IMWRITE_PNG_STRATEGY_RLE(Global Namespace)']]], - ['imwrite_5fpxm_5fbinary_219',['IMWRITE_PXM_BINARY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca6ad01adc2675d735ec8424e6e7562087',1,'cv::IMWRITE_PXM_BINARY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca6ad01adc2675d735ec8424e6e7562087',1,'IMWRITE_PXM_BINARY(Global Namespace)']]], - ['imwrite_5ftiff_5fcompression_220',['IMWRITE_TIFF_COMPRESSION',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acad3d5dac0cfc770b96fc61e895a165fa4',1,'cv::IMWRITE_TIFF_COMPRESSION'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acad3d5dac0cfc770b96fc61e895a165fa4',1,'IMWRITE_TIFF_COMPRESSION(Global Namespace)']]], - ['imwrite_5ftiff_5fresunit_221',['IMWRITE_TIFF_RESUNIT',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaac188d2ba4ccffdda3d820c8e9dfa7c0',1,'cv::IMWRITE_TIFF_RESUNIT'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaac188d2ba4ccffdda3d820c8e9dfa7c0',1,'IMWRITE_TIFF_RESUNIT(Global Namespace)']]], - ['imwrite_5ftiff_5fxdpi_222',['IMWRITE_TIFF_XDPI',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca59a88cc19c00988a6677c60e5f6b03d0',1,'cv::IMWRITE_TIFF_XDPI'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca59a88cc19c00988a6677c60e5f6b03d0',1,'IMWRITE_TIFF_XDPI(Global Namespace)']]], - ['imwrite_5ftiff_5fydpi_223',['IMWRITE_TIFF_YDPI',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca76b632839a9f3e542e90fa7bfcfd8b9a',1,'cv::IMWRITE_TIFF_YDPI'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca76b632839a9f3e542e90fa7bfcfd8b9a',1,'IMWRITE_TIFF_YDPI(Global Namespace)']]], - ['imwrite_5fwebp_5fquality_224',['IMWRITE_WEBP_QUALITY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca7d3f848cc45d3138de0a2053d213a54a',1,'cv::IMWRITE_WEBP_QUALITY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca7d3f848cc45d3138de0a2053d213a54a',1,'IMWRITE_WEBP_QUALITY(Global Namespace)']]], - ['imwriteexrtypeflags_225',['ImwriteEXRTypeFlags',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga47d07d14b3c33151daac7fde6f34e897',1,'cv::ImwriteEXRTypeFlags'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga47d07d14b3c33151daac7fde6f34e897',1,'ImwriteEXRTypeFlags(Global Namespace)']]], - ['imwriteflags_226',['ImwriteFlags',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga292d81be8d76901bff7988d18d2b42ac',1,'cv::ImwriteFlags'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga292d81be8d76901bff7988d18d2b42ac',1,'ImwriteFlags(Global Namespace)']]], - ['imwritepamflags_227',['ImwritePAMFlags',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga4e6c77a906952525a4d22fb3efea0e01',1,'cv::ImwritePAMFlags'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga4e6c77a906952525a4d22fb3efea0e01',1,'ImwritePAMFlags(Global Namespace)']]], - ['imwritepngflags_228',['ImwritePNGFlags',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gaa60044d347ffd187161b5ec9ea2ef2f9',1,'cv::ImwritePNGFlags'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gaa60044d347ffd187161b5ec9ea2ef2f9',1,'ImwritePNGFlags(Global Namespace)']]], - ['in_229',['in',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'basic_ios< char, _Traits >::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'basic_iostream< char >::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'basic_istream< char >::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'basic_istream< char, _Traits >::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'basic_ostream< char >::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'basic_ostream< char, _Traits >::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_fstream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_ifstream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_ios::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_iostream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_istream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_istringstream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_ofstream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_ostream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_ostringstream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_stringstream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::ios_base::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'__codecvt_abstract_base< _InternT, _ExternT, encoding_state >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'__codecvt_abstract_base< char, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'__codecvt_abstract_base< char16_t, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'__codecvt_abstract_base< char32_t, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'__codecvt_abstract_base< wchar_t, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'codecvt< _Elem, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::__codecvt_abstract_base::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt< _InternT, _ExternT, encoding_state >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt< char, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt< char16_t, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt< char32_t, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt< wchar_t, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt_byname::in()']]], - ['in_230',['In',['https://docs.opencv.org/4.2.0/dd/d98/structcv_1_1gapi_1_1ie_1_1PortCfg.html#ad9c639e74f1c6a4c9ef143e730f70478',1,'cv::gapi::ie::PortCfg']]], - ['in_20a_20video_231',['Face landmark detection in a video',['https://docs.opencv.org/4.2.0/d8/d3c/tutorial_face_landmark_detection_in_video.html',1,'']]], - ['in_20an_20image_232',['Face landmark detection in an image',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'']]], - ['in_20android_20camera_20preview_20based_20cv_20application_233',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], - ['in_20browser_234',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], - ['in_20c_235',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], - ['in_20cmake_20projects_236',['Using Eigen in CMake Projects',['https://eigen.tuxfamily.org/dox/TopicCMakeGuide.html',1,'']]], - ['in_20cuda_20kernels_237',['Using Eigen in CUDA kernels',['https://eigen.tuxfamily.org/dox/TopicCUDA.html',1,'']]], - ['in_20eigen_238',['Expression templates in Eigen',['https://eigen.tuxfamily.org/dox/TopicEigenExpressionTemplates.html',1,'']]], - ['in_20fedora_239',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], - ['in_20ios_240',['Installation in iOS',['https://docs.opencv.org/4.2.0/d5/da3/tutorial_ios_install.html',1,'']]], - ['in_20linux_241',['Installation in Linux',['https://docs.opencv.org/4.2.0/d7/d9f/tutorial_linux_install.html',1,'']]], - ['in_20macos_242',['Installation in MacOS',['https://docs.opencv.org/4.2.0/d0/db2/tutorial_macos_install.html',1,'']]], - ['in_20memory_20images_20in_20the_20visual_20studio_20debugger_243',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['in_20multi_20dimensional_20spaces_244',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], - ['in_20node_20js_245',['Using OpenCV.js In Node.js',['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'']]], - ['in_20opencv_246',['in OpenCV',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html',1,'ColorMaps in OpenCV'],['https://docs.opencv.org/4.2.0/d3/d05/tutorial_py_table_of_contents_contours.html',1,'Contours in OpenCV'],['https://docs.opencv.org/4.2.0/dc/da5/tutorial_py_drawing_functions.html',1,'Drawing Functions in OpenCV'],['https://docs.opencv.org/4.2.0/dc/d4d/tutorial_py_table_of_contents_gui.html',1,'Gui Features in OpenCV'],['https://docs.opencv.org/4.2.0/de/db2/tutorial_py_table_of_contents_histograms.html',1,'Histograms in OpenCV'],['https://docs.opencv.org/4.2.0/d2/d96/tutorial_py_table_of_contents_imgproc.html',1,'Image Processing in OpenCV'],['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'Image Transforms in OpenCV'],['https://docs.opencv.org/4.2.0/d1/d5c/tutorial_py_kmeans_opencv.html',1,'K-Means Clustering in OpenCV']]], - ['in_20opencv_20js_247',['in OpenCV js',['https://docs.opencv.org/4.2.0/d0/d43/tutorial_js_table_of_contents_contours.html',1,'Contours in OpenCV.js'],['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'Histograms in OpenCV.js'],['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'Image Transforms in OpenCV.js']]], - ['in_20subpixels_248',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], - ['in_20ubuntu_249',['Install OpenCV-Python in Ubuntu',['https://docs.opencv.org/4.2.0/d2/de6/tutorial_py_setup_in_ubuntu.html',1,'']]], - ['in_20video_20capture_250',['Face Detection in Video Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'']]], - ['in_20windows_251',['in Windows',['https://docs.opencv.org/4.2.0/d5/de5/tutorial_py_setup_in_windows.html',1,'Install OpenCV-Python in Windows'],['https://docs.opencv.org/4.2.0/d3/d52/tutorial_windows_install.html',1,'Installation in Windows']]], - ['in_20your_20image_252',['Finding contours in your image',['https://docs.opencv.org/4.2.0/df/d0d/tutorial_find_contours.html',1,'']]], - ['in_5favail_253',['in_avail',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'__gnu_cxx::enc_filebuf::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'__gnu_cxx::stdio_filebuf::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'__gnu_cxx::stdio_sync_filebuf::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'basic_filebuf< char_type, traits_type >::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'basic_streambuf< _Elem, _Tr >::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'basic_streambuf< char, _Traits >::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'basic_streambuf< char, char_traits< char > >::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'std::basic_filebuf::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'std::basic_streambuf::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'std::basic_stringbuf::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'std::wbuffer_convert::in_avail()']]], - ['in_5fplace_254',['in_place',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html#ga69b3880c858acc1b7f88478d209b2fb3',1,]]], - ['in_5fplace_5ft_255',['in_place_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10075.html',1,'std::experimental::fundamentals_v1']]], - ['in_5ftag_256',['In_Tag',['https://docs.opencv.org/4.2.0/d0/dde/structcv_1_1In__Tag.html',1,'cv']]], - ['inarg_257',['inArg',['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1detail_1_1GCompoundContext.html#ada1625c10da81a26710a2a56ce8e4c9a',1,'cv::detail::GCompoundContext::inArg()'],['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#adfe05f64a47014aed5e2569fb9b01f96',1,'cv::GCPUContext::inArg()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a3dc8d9a90a8aa11096b7624a739ee8b8',1,'cv::GOCLContext::inArg()'],['https://docs.opencv.org/4.2.0/de/d5f/structcv_1_1GPlaidMLContext.html#a23fcdd9022a11fd08605e4c0262dccac',1,'cv::GPlaidMLContext::inArg()']]], - ['inargs_258',['InArgs',['https://docs.opencv.org/4.2.0/df/d7c/classcv_1_1GKernelType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a7215cc7c28a5d1d3d20397e3bcba6675',1,'cv::GKernelType< K, std::function< R(Args...)> >::InArgs'],['https://docs.opencv.org/4.2.0/dc/d2d/classcv_1_1GKernelTypeM_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a2839de0a0c028b1112bc115e67b08e23',1,'cv::GKernelTypeM< K, std::function< std::tuple< R... >(Args...)> >::InArgs'],['https://docs.opencv.org/4.2.0/dc/de8/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a4e620f80b7c2260381689f2917c3dc9d',1,'cv::GNetworkType< K, std::function< R(Args...)> >::InArgs'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a3713cb5a0d98f023b092dbff23be9766',1,'cv::GNetworkType< K, std::function< std::tuple< R... >(Args...)> >::InArgs']]], - ['include_259',['include',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#acd1c2ad5bf8bf27f0b61ae858da370bd',1,'cv::gapi::GKernelPackage']]], - ['includes_260',['includes',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#aeb06af2712efd64912a5fa1a42837f8f',1,'cv::gapi::GKernelPackage::includes()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga67c9386f01daa7763952b9096ab94c96',1,'std::includes(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#gaeffeb80fabc63883a4d5e907ca922913',1,'std::includes(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga67c9386f01daa7763952b9096ab94c96',1,'includes(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#gaeffeb80fabc63883a4d5e907ca922913',1,'includes(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _Compare __comp)(Global Namespace)']]], - ['includesapi_261',['includesAPI',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#aa2fd0bdce5a1e84888077349ef261908',1,'cv::gapi::GKernelPackage']]], - ['incompletecholesky_262',['IncompleteCholesky',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html',1,'Eigen::IncompleteCholesky< class, _UpLo, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#adaaa3975b8cf53f910d6a3344af92379',1,'Eigen::IncompleteCholesky::IncompleteCholesky()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a757499fc814988a5b112b1f34d0295e1',1,'Eigen::IncompleteCholesky::IncompleteCholesky(const MatrixType &matrix)']]], - ['incompletelut_263',['IncompleteLUT',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteLUT.html',1,'Eigen']]], - ['increment_264',['increment',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#ad2d0da3af999df8d7992143640f344a6',1,'std::linear_congruential_engine']]], - ['incvmemallocator_265',['INCVMemAllocator',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html',1,'']]], - ['ind1_266',['ind1',['https://docs.opencv.org/4.2.0/db/d26/structcv_1_1face_1_1FacemarkAAM_1_1Model_1_1Texture.html#aa231d8739097f2aeb0df0ab2de2bfd0e',1,'cv::face::FacemarkAAM::Model::Texture']]], - ['ind2_267',['ind2',['https://docs.opencv.org/4.2.0/db/d26/structcv_1_1face_1_1FacemarkAAM_1_1Model_1_1Texture.html#a350bda90f3aba032c2b0ae5f02ce6238',1,'cv::face::FacemarkAAM::Model::Texture']]], - ['independent_20elementary_20features_268',['BRIEF (Binary Robust Independent Elementary Features)',['https://docs.opencv.org/4.2.0/dc/d7d/tutorial_py_brief.html',1,'']]], - ['independent_5fbits_5fengine_269',['independent_bits_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html',1,'std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#ac39fb77deb769d85123ece7b6c981c8f',1,'std::independent_bits_engine::independent_bits_engine()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a4d92ca47578567e9465b90b6461acb39',1,'std::independent_bits_engine::independent_bits_engine(const _RandomNumberEngine &__rng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#ae6b9f2ddf321e24e8bae7edd6f4c2e7d',1,'std::independent_bits_engine::independent_bits_engine(_RandomNumberEngine &&__rng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#ad54d8549b7e6e4f9908486383d543efa',1,'std::independent_bits_engine::independent_bits_engine(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a1b27f8236f8a90380ea7fab8a3014d90',1,'std::independent_bits_engine::independent_bits_engine(_Sseq &__q)']]], - ['index_270',['index',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a6e86a7a617c062c8e36c3e991fa3fc1c',1,'cv::util::variant::index()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a6e86a7a617c062c8e36c3e991fa3fc1c',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::index()']]], - ['index_271',['Index',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a774ef355da13d6bee6a6e7244c15231a',1,'Eigen::AlignedBox::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#abc0218d8b902af0d6c759bfc0a8a8d74',1,'Eigen::ComplexEigenSolver::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a652104d13723a5b1db2937866a034557',1,'Eigen::ComplexSchur::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a652104d13723a5b1db2937866a034557',1,'ComplexSchur< MatrixType >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'Eigen::EigenBase::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< FullPivLU< _MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< HouseholderQR< _MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< Inverse< PermutationType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< LLT< _MatrixType, _UpLo > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< PartialPivLU< _MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< PermutationWrapper< _IndicesType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SVDBase< Derived > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< Transpose< MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< TriangularView< MatrixType, Mode > >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a5bff6a6bc0efac67d52c60c2c3deb9ee',1,'Eigen::EigenSolver::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#a46a0ff3841059479ec314e56a5645302',1,'Eigen::GeneralizedEigenSolver::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a8e287ac222f53e2c8ce82faa43e95ac6',1,'Eigen::HessenbergDecomposition::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a8e287ac222f53e2c8ce82faa43e95ac6',1,'HessenbergDecomposition< MatrixType >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a58d2307d16128a0026021374e9e10465',1,'Eigen::Hyperplane::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a3c9f84dd8608940282b16652a296c764',1,'Eigen::ParametrizedLine::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a6201e534e901b5f4e66f72c176b534a3',1,'Eigen::RealQZ::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a6201e534e901b5f4e66f72c176b534a3',1,'RealQZ< MatrixType >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a8bd4653e2d9569a44ecc95e746422d3f',1,'Eigen::RealSchur::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a8bd4653e2d9569a44ecc95e746422d3f',1,'RealSchur< MatrixType >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a8a59ab7734b6eae2754fd78bc7c3a360',1,'Eigen::SelfAdjointEigenSolver::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a96c2dfb0ce43fd8e19adcdf6094f5f63',1,'Eigen::Stride::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a96c2dfb0ce43fd8e19adcdf6094f5f63',1,'Stride< 0, Value >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a96c2dfb0ce43fd8e19adcdf6094f5f63',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a96c2dfb0ce43fd8e19adcdf6094f5f63',1,'Stride< Value, 0 >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a6229a37997eca1072b52cca5ee7a2bec',1,'Eigen::SVDBase::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a6229a37997eca1072b52cca5ee7a2bec',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a49df3689ac2b736bcb564dec47d6486c',1,'Eigen::Transform::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a7bd1f9fccec1e93b77a2214b2d30aae9',1,'Eigen::Tridiagonalization::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'Eigen::VectorwiseOp::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const Derived, Horizontal >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const Derived, Vertical >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::Index']]], - ['index_272',['index',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga82775e152f8a74c5fe06f5a7343e0233a9dfc90ef6dc3ba62850d76cc3534572c',1,'cv::datasets::index'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga82775e152f8a74c5fe06f5a7343e0233a9dfc90ef6dc3ba62850d76cc3534572c',1,'index(Global Namespace)']]], - ['index_273',['Index',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a62e77e0933482dafde8fe197d9a2cfde',1,'Eigen']]], - ['index_5fof_274',['index_of',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#aa87645829693267bb0f0ecd5325a1fc7',1,'cv::util::variant::index_of()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#aa87645829693267bb0f0ecd5325a1fc7',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::index_of()']]], - ['index_5fsequence_275',['index_sequence',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acdfada06a9fb47abbf52c264b95e689e',1,'std']]], - ['index_5fsequence_5ffor_276',['index_sequence_for',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af540abd32f95a08e48ea6ca00a5a8ad3',1,'std']]], - ['index_5ftesting_2eh_277',['index_testing.h',['https://docs.opencv.org/4.2.0/db/dd9/index__testing_8h.html',1,'']]], - ['index_5ftype_278',['index_type',['https://docs.opencv.org/4.2.0/d0/d2a/structcv_1_1cudev_1_1AffineMapPtr.html#a52baed9ba6f948c8f7192d85fb3eb40f',1,'cv::cudev::AffineMapPtr::index_type'],['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#a0bdd1eec197cb450b6686d9446a13266',1,'cv::cudev::BinaryTransformPtr::index_type'],['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#a0616b2b0e5a3ce7414145c814587c450',1,'cv::cudev::BrdBase::index_type'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#a1100a33c7f274feb2bd7e429f79c385b',1,'cv::cudev::BrdConstant::index_type'],['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#ad8e2789fa7f25353cba39526ecbc7365',1,'cv::cudev::CommonAreaInterPtr::index_type'],['https://docs.opencv.org/4.2.0/d5/db7/structcv_1_1cudev_1_1ConstantPtr.html#afb3346bf66085990c971571f0612b11e',1,'cv::cudev::ConstantPtr::index_type'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1CubicInterPtr.html#ae192c2869b7e71065042816f3c4a03b8',1,'cv::cudev::CubicInterPtr::index_type'],['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1cudev_1_1DerivXPtr.html#a8a6529e58144169e05302134f8f99ea3',1,'cv::cudev::DerivXPtr::index_type'],['https://docs.opencv.org/4.2.0/dc/d51/structcv_1_1cudev_1_1DerivYPtr.html#ae2c972cf881553226cc8ad67edfcd968',1,'cv::cudev::DerivYPtr::index_type'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#ae82f92236ad754a0536d05d3b00aebaf',1,'cv::cudev::GlobPtr::index_type'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#a79490d776322b5e52d52887189e3a04f',1,'cv::cudev::IntegerAreaInterPtr::index_type'],['https://docs.opencv.org/4.2.0/d0/de6/structcv_1_1cudev_1_1LaplacianPtr_3_011_00_01SrcPtr_01_4.html#a88eb6eeba437a94c7fe38938254e67f3',1,'cv::cudev::LaplacianPtr< 1, SrcPtr >::index_type'],['https://docs.opencv.org/4.2.0/d4/d89/structcv_1_1cudev_1_1LaplacianPtr_3_013_00_01SrcPtr_01_4.html#a1d2bceaadc82fb32c2c7c91a694370ab',1,'cv::cudev::LaplacianPtr< 3, SrcPtr >::index_type'],['https://docs.opencv.org/4.2.0/d7/d8a/structcv_1_1cudev_1_1LinearInterPtr.html#a1f415bf0b9d4a4f2bb8b8bfe43494e16',1,'cv::cudev::LinearInterPtr::index_type'],['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html#a0409c343dbf9496efa21aa1b3a5ad170',1,'cv::cudev::LutPtr::index_type'],['https://docs.opencv.org/4.2.0/d0/df5/structcv_1_1cudev_1_1NearestInterPtr.html#a4eab6aaed5972a20a156bc805e47fe66',1,'cv::cudev::NearestInterPtr::index_type'],['https://docs.opencv.org/4.2.0/df/d20/structcv_1_1cudev_1_1PerspectiveMapPtr.html#aeac29e6301d93225405fdcdb8a2bf966',1,'cv::cudev::PerspectiveMapPtr::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'cv::cudev::PtrTraitsBase::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< AffineMapPtrSz, AffineMapPtr >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op >, BinaryTransformPtr< Src1Ptr, Src2Ptr, Op > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< CommonAreaInterPtrSz< SrcPtr >, CommonAreaInterPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< ConstantPtrSz< T >, ConstantPtr< T > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< CubicInterPtrSz< SrcPtr >, CubicInterPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< DerivXPtrSz< SrcPtr >, DerivXPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< DerivYPtrSz< SrcPtr >, DerivYPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< GlobPtrSz< T >, GlobPtr< T > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< GpuMat_< T >, GlobPtr< T > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< IntegerAreaInterPtrSz< SrcPtr >, IntegerAreaInterPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< LaplacianPtrSz< ksize, SrcPtr >, LaplacianPtr< ksize, SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< LinearInterPtrSz< SrcPtr >, LinearInterPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< LutPtrSz< SrcPtr, TablePtr >, LutPtr< SrcPtr, TablePtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< NearestInterPtrSz< SrcPtr >, NearestInterPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< PerspectiveMapPtrSz, PerspectiveMapPtr >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< Ptr2DSz, Ptr2DSz >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< RemapPtr1Sz< SrcPtr, MapPtr >, RemapPtr1< SrcPtr, MapPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr >, RemapPtr2< SrcPtr, MapXPtr, MapYPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< ResizePtrSz< SrcPtr >, ResizePtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< ScharrXPtrSz< SrcPtr >, ScharrXPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< ScharrYPtrSz< SrcPtr >, ScharrYPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< SingleMaskChannelsSz< MaskPtr >, SingleMaskChannels< MaskPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< SobelXPtrSz< SrcPtr >, SobelXPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< SobelYPtrSz< SrcPtr >, SobelYPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< SrcPtr, SrcPtr >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< Texture< T >, TexturePtr< T > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< UnaryTransformPtrSz< SrcPtr, Op >, UnaryTransformPtr< SrcPtr, Op > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< ZipPtrSz< PtrTuple >, ZipPtr< PtrTuple > >::index_type'],['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html#a93fb128c29bc8b76bcd6ad3a64418b32',1,'cv::cudev::RemapPtr1::index_type'],['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#a35f9b626f26772c62ff27b187b9e38aa',1,'cv::cudev::RemapPtr2::index_type'],['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#aebd016a3f088f40525b0e633aa4c87ab',1,'cv::cudev::ResizePtr::index_type'],['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1ScharrXPtr.html#aa3182f8d3fd3a0cd65471fc1d782c9fd',1,'cv::cudev::ScharrXPtr::index_type'],['https://docs.opencv.org/4.2.0/d0/d70/structcv_1_1cudev_1_1ScharrYPtr.html#a49fe3fe3aa0ea551fff971781ad6b7ee',1,'cv::cudev::ScharrYPtr::index_type'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#a0f94a551bd9ff52f29577f222a8e6136',1,'cv::cudev::SingleMaskChannels::index_type'],['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1SobelXPtr.html#a46ed3a67cfa9e549dd435a19ecac1192',1,'cv::cudev::SobelXPtr::index_type'],['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1SobelYPtr.html#a18f6a5514170a42e4bfaf226903f3055',1,'cv::cudev::SobelYPtr::index_type'],['https://docs.opencv.org/4.2.0/d2/d09/structcv_1_1cudev_1_1TexturePtr.html#ae3381236f733dd74cdad90d015033c63',1,'cv::cudev::TexturePtr::index_type'],['https://docs.opencv.org/4.2.0/dd/d01/structcv_1_1cudev_1_1UnaryTransformPtr.html#ae3cf5bd15f570325ccfbeb3a54baf59e',1,'cv::cudev::UnaryTransformPtr::index_type'],['https://docs.opencv.org/4.2.0/da/d2c/structcv_1_1cudev_1_1WithOutMask.html#a8aae96956a3c84d9e88fee0594712a51',1,'cv::cudev::WithOutMask::index_type'],['https://docs.opencv.org/4.2.0/dd/de4/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_01_4_01_4.html#a820cd1f65049b4c916ab0e6e67b9f9c3',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1 > >::index_type'],['https://docs.opencv.org/4.2.0/d4/dff/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_01_4_01_4.html#a99060d65ba9a309ad4eadc7c2ee00798',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2 > >::index_type'],['https://docs.opencv.org/4.2.0/dd/d2b/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_00_01Ptr3_01_4_01_4.html#afe116ee4f760f37fb1069325c6bbfb32',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2, Ptr3 > >::index_type']]], - ['indexedview_279',['IndexedView',['https://eigen.tuxfamily.org/dox/classEigen_1_1IndexedView.html',1,'Eigen']]], - ['indexing_280',['Slicing and Indexing',['https://eigen.tuxfamily.org/dox/group__TutorialSlicingIndexing.html',1,'']]], - ['indexparams_281',['indexParams',['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#af2b50fb9c749ff4e14902192326247ad',1,'cv::FlannBasedMatcher']]], - ['indexpcflann_282',['indexPCFlann',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gadca01b67adab0bbbdd5b2507f63c7f21',1,'cv::ppf_match_3d::indexPCFlann()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gadca01b67adab0bbbdd5b2507f63c7f21',1,'indexPCFlann()(Global Namespace)']]], - ['indication_5ft_283',['indication_t',['../namespacerobot_1_1types.html#a2ed6fa6081a4897f2e496d80b140775f',1,'robot::types']]], - ['indices_284',['indices',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a16fa3afafdf703399d62c80f950802f1',1,'Eigen::PermutationBase::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adec727546b6882ecaa57e76d084951c5',1,'Eigen::PermutationBase::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a16fa3afafdf703399d62c80f950802f1',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adec727546b6882ecaa57e76d084951c5',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a16fa3afafdf703399d62c80f950802f1',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adec727546b6882ecaa57e76d084951c5',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a16fa3afafdf703399d62c80f950802f1',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adec727546b6882ecaa57e76d084951c5',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a16fa3afafdf703399d62c80f950802f1',1,'PermutationBase< PermutationWrapper< _IndicesType > >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adec727546b6882ecaa57e76d084951c5',1,'PermutationBase< PermutationWrapper< _IndicesType > >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#ac089ead468a58d75f276ad2b253578c0',1,'Eigen::PermutationMatrix::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a2f1ab379207fcd1ceb33941e25cf50c2',1,'Eigen::PermutationMatrix::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#ac089ead468a58d75f276ad2b253578c0',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a2f1ab379207fcd1ceb33941e25cf50c2',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#ac089ead468a58d75f276ad2b253578c0',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a2f1ab379207fcd1ceb33941e25cf50c2',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#ac089ead468a58d75f276ad2b253578c0',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a2f1ab379207fcd1ceb33941e25cf50c2',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationWrapper.html#a88ae93cc14c136b2eec4a286b4c10c34',1,'Eigen::PermutationWrapper::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a678dfbd513871473bcd36bbc453eed8c',1,'Eigen::Transpositions::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a786fd676c156124025aaf446d811d14f',1,'Eigen::Transpositions::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a678dfbd513871473bcd36bbc453eed8c',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a786fd676c156124025aaf446d811d14f',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::indices() const']]], - ['indigo_285',['indigo',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a8fe4df9b2018005398ab65df2bd400f1',1,'cv::viz::Color']]], - ['indirect_5farray_286',['indirect_array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04663.html',1,'std::indirect_array< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad5e982b5f515ce67d9e6b55c84a61cb2',1,'std::indirect_array::indirect_array()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad5e982b5f515ce67d9e6b55c84a61cb2',1,'indirect_array(const indirect_array &)(Global Namespace)']]], - ['indirect_5farray_2eh_287',['indirect_array.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00380.html',1,'']]], - ['inf_288',['inf',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadd37b1cc59a301a3e1b269ade244712c',1,'cv::softdouble::inf()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga15b1c64547f8da94c0c6e0c21e5cc568',1,'cv::softfloat::inf()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga15b1c64547f8da94c0c6e0c21e5cc568',1,'inf()(Global Namespace)']]], - ['infer_289',['infer',['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#a90d6679e32f4bdfabe3a990d06c02876',1,'cv::gapi::infer(cv::GArray< cv::Rect > roi, Args &&... args)'],['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#ad56fa2785be315ddc82a800878123a58',1,'cv::gapi::infer(Args &&... args)']]], - ['infer_2ehpp_290',['infer.hpp',['https://docs.opencv.org/4.2.0/d6/d32/infer_8hpp.html',1,'']]], - ['inferbbox_291',['InferBbox',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html',1,'cv::dnn_objdetect::InferBbox'],['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a480ff4d0ebdb8a41e685e3f719b8e607',1,'cv::dnn_objdetect::InferBbox::InferBbox()']]], - ['inference_5fengine_2ehpp_292',['inference_engine.hpp',['https://docs.opencv.org/4.2.0/d8/dcd/inference__engine_8hpp.html',1,'']]], - ['infinity_293',['infinity',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#ae18eb0704a24559eee8bec962285bef2',1,'std::numeric_limits']]], - ['infinity_294',['Infinity',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a7951593b031e13d90223c83d022ce99e',1,'Eigen']]], - ['info_295',['Calibration Info',['../cameraconfig.html#calibinfo',1,'']]], - ['info_296',['info',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ada4cc43c64767d186fcb8997440cc753',1,'Eigen::CholmodBase::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ada4cc43c64767d186fcb8997440cc753',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ada4cc43c64767d186fcb8997440cc753',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ada4cc43c64767d186fcb8997440cc753',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ada4cc43c64767d186fcb8997440cc753',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a5c756a789175197cab3eff3a3e479ef2',1,'Eigen::ColPivHouseholderQR::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a5c756a789175197cab3eff3a3e479ef2',1,'ColPivHouseholderQR< MatrixType >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a1f5c45f78848cfdbb96963cefbbb3274',1,'Eigen::CompleteOrthogonalDecomposition::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#ad4d9d8b90145900b9686d2dabbe46730',1,'Eigen::ComplexEigenSolver::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a8c5ee15fecfd126fc362c3f2fd28f51e',1,'Eigen::ComplexSchur::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a8c5ee15fecfd126fc362c3f2fd28f51e',1,'ComplexSchur< MatrixType >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#ac4af54fadc33abcdd1778c87bfbf005b',1,'Eigen::EigenSolver::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#ada0e68cb22601849464506f5986a88c1',1,'Eigen::IncompleteCholesky::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteLUT.html#a941c7d34f15d7bc287e780636be0ee2b',1,'Eigen::IncompleteLUT::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a0d6b459433a316b4f12d48e5c80d61fe',1,'Eigen::IterativeSolverBase::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a6bd6008501a537d2e16ea672a853bf3e',1,'Eigen::LDLT::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#adb1295e7d2b1fd825a041345ae08be54',1,'Eigen::LLT::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a36bd77afed89f3f5c110a715e69e4c64',1,'Eigen::RealQZ::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a36bd77afed89f3f5c110a715e69e4c64',1,'RealQZ< MatrixType >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a386fd2b1a3a8401eca7183ac074deec8',1,'Eigen::RealSchur::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a386fd2b1a3a8401eca7183ac074deec8',1,'RealSchur< MatrixType >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a31e8a509231e57e684c53799693607ae',1,'Eigen::SelfAdjointEigenSolver::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html#a3ac877f73aaaff670e6ae7554eb02fc8',1,'Eigen::SimplicialCholeskyBase::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a5fad91f861a11cc3c6eae2642eb0d42a',1,'Eigen::SparseLU::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#aa04cc22061d0771f988509c54be3a740',1,'Eigen::SparseQR::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#afbbebf50229522d4487befff158e0d19',1,'Eigen::SPQR::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#aa67da5c8c24110931c949c5896c5ec03',1,'Eigen::SuperLUBase::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#aa67da5c8c24110931c949c5896c5ec03',1,'SuperLUBase< _MatrixType, SuperILU< _MatrixType > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#aa67da5c8c24110931c949c5896c5ec03',1,'SuperLUBase< _MatrixType, SuperLU< _MatrixType > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a06c311bc452dc1ca5abce2f640e15292',1,'Eigen::SVDBase::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a06c311bc452dc1ca5abce2f640e15292',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UmfPackLU.html#a68738a0d99c67316877706f98b033402',1,'Eigen::UmfPackLU::info()']]], - ['information_297',['Initialization and Information',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html',1,'']]], - ['inheriting_20from_20matrix_298',['Inheriting from Matrix',['https://eigen.tuxfamily.org/dox/TopicCustomizing_InheritingMatrix.html',1,'']]], - ['init_299',['init',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f07de15ae1dea185ddbdd69aa36fcb4',1,'cv::_InputArray::init(int _flags, const void *_obj)'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a296e276ec57703236b468acf43ca7755',1,'cv::_InputArray::init(int _flags, const void *_obj, Size _sz)'],['https://docs.opencv.org/4.2.0/d9/d0b/classcv_1_1tracking_1_1AugmentedUnscentedKalmanFilterParams.html#ae86a211fe5efabccb9a6439a88f197a8',1,'cv::tracking::AugmentedUnscentedKalmanFilterParams::init()'],['https://docs.opencv.org/4.2.0/dc/d72/classcv_1_1ClfMilBoost.html#add6da766c67fd96ffcc90a8230c7b887',1,'cv::ClfMilBoost::init()'],['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a6acf44f4411efd7c3a35c98601791af6',1,'cv::ClfOnlineStump::init()'],['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#aa1887b811d185f3847ec4dd73fa6ac45',1,'cv::CvFeatureEvaluator::init()'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#ad5645b1420dd99681dff89c4ea7ecd64',1,'cv::CvFeatureParams::init()'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#af8a0fbf8f6cb81f50466c8c6d39c04a2',1,'cv::CvHaarEvaluator::init()'],['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#a3411564ba2d415cf995be910c4497928',1,'cv::CvHaarFeatureParams::init()'],['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#a0d767f8bb6542b0a04c6cd5c1875b2f4',1,'cv::CvHOGEvaluator::init()'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#a7663c634ead66984a4e78934a5d94cea',1,'cv::CvLBPEvaluator::init()'],['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a4f136c39c016d3530c7c5801dd1ddb3b',1,'cv::KalmanFilter::init()'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a586631c66b5acecd6105da02936b63a0',1,'cv::saliency::MotionSaliencyBinWangApr2014::init()'],['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#acbe9be31cecb11ea14fcf4b0fafe6f3d',1,'cv::NAryMatIterator::init()'],['https://docs.opencv.org/4.2.0/da/d6a/classcv_1_1face_1_1PredictCollector.html#a67952d3d5e30b1d67cabc38103543562',1,'cv::face::PredictCollector::init()'],['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#abea06e64f8ff2db82711c479b2582f63',1,'cv::face::StandardCollector::init()'],['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a4d285747589b1bdd16d2e4f00c3255dc',1,'cv::Tracker::init()'],['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a23b7cf2dddb0d075a69eee8880f41db3',1,'cv::tracking::UnscentedKalmanFilterParams::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'basic_ios< char, _Traits >::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'basic_iostream< char >::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'basic_istream< char >::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'basic_istream< char, _Traits >::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'basic_ostream< char >::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'basic_ostream< char, _Traits >::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_fstream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_ifstream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_ios::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_iostream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_istream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_istringstream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_ofstream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_ostream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_ostringstream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_stringstream::init()']]], - ['init_5fscratch_300',['init_scratch',['https://docs.opencv.org/4.2.0/d4/d77/structcv_1_1detail_1_1FluidCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_16cb3b081e952d44068dce53ded07afdc.html#a7dddf7fd06878a65125a3593edb9d076',1,'cv::detail::FluidCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... >, UseScratch >']]], - ['initbaseclassifier_301',['initBaseClassifier',['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html#adf249204640279fe5642afc176d3f0b7',1,'cv::StrongClassifierDirectSelection']]], - ['initcameramatrix2d_302',['initCameraMatrix2D',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga8132c7dbbb61738cc3510bebbdffde55',1,'cv::initCameraMatrix2D()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga8132c7dbbb61738cc3510bebbdffde55',1,'initCameraMatrix2D()(Global Namespace)']]], - ['initcan_303',['initCAN',['../namespacecan.html#ae83e4f4aad3eab06ec0d515db4112bd8',1,'can']]], - ['initcontainer_304',['initContainer',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#ac344a0611fc612f8aedd78fc841dc644',1,'cv::AVIWriteContainer']]], - ['initcuda_305',['initCUDA',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a3f8f7a01976709a0112be796dc8662ad',1,'cv::dnn::Layer']]], - ['initdataset_306',['initDataset',['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a19867eeb429143a99406748d18dde297',1,'cv::datasets::TRACK_alov::initDataset()'],['https://docs.opencv.org/4.2.0/dc/d52/classcv_1_1datasets_1_1TRACK__vot.html#a318e12a6a84809f8fc5d332a5256eda7',1,'cv::datasets::TRACK_vot::initDataset()']]], - ['initdelaunay_307',['initDelaunay',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#ae4a3d65e798c46fd6ce64370f24b0287',1,'cv::Subdiv2D']]], - ['initencoder_308',['initEncoder',['../namespacecan_1_1motor.html#a6a94bbe1a8abe8fd968d4c56658960a7',1,'can::motor']]], - ['inithalide_309',['initHalide',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a0b980c3fbb9d0899484fd0ef1e2b4881',1,'cv::dnn::Layer']]], - ['initialframe_310',['initialFrame',['https://docs.opencv.org/4.2.0/d7/dce/structcv_1_1datasets_1_1groundTruth.html#a65def147b12803d2daa714002fe58196',1,'cv::datasets::groundTruth']]], - ['initialization_311',['Advanced initialization',['https://eigen.tuxfamily.org/dox/group__TutorialAdvancedInitialization.html',1,'']]], - ['initialization_20and_20information_312',['Initialization and Information',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html',1,'']]], - ['initialize_313',['initialize',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a856200bc1f30bed5d7f2a0a9b717783a',1,'cv::rgbd::DepthCleaner::initialize()'],['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#a02b88a2f282b66838e327df030c1d778',1,'cv::multicalib::MultiCameraCalibration::initialize()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#ac7eb4c3b91d478cde76fcfa547c6bc53',1,'cv::rgbd::RgbdNormals::initialize()'],['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#aaf0f7c4128009f02473332a0c41f6345',1,'cv::detail::Timelapser::initialize()'],['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1detail_1_1TimelapserCrop.html#a2115fe1f39d2eae194cc201aa335b7e9',1,'cv::detail::TimelapserCrop::initialize()']]], - ['initialize_5fcleaner_5fimpl_314',['initialize_cleaner_impl',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#ab2603f7fbc0c9da018bb41b27d4225a1',1,'cv::rgbd::DepthCleaner']]], - ['initialize_5fnormals_5fimpl_315',['initialize_normals_impl',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a7ae1d70de30fc78ff67be0b43834cb73',1,'cv::rgbd::RgbdNormals']]], - ['initializecalibration_316',['initializeCalibration',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a97d02afc97ddf9a7eb52ed188b3c5087',1,'cv::omnidir::internal']]], - ['initializecontextfromd3d10device_317',['initializeContextFromD3D10Device',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga7ec329adfc06ad752009722f6942f98a',1,'cv::directx::ocl::initializeContextFromD3D10Device()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga7ec329adfc06ad752009722f6942f98a',1,'initializeContextFromD3D10Device()(Global Namespace)']]], - ['initializecontextfromd3d11device_318',['initializeContextFromD3D11Device',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#gac1d923df82d681aca666ad85835945d1',1,'cv::directx::ocl::initializeContextFromD3D11Device()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#gac1d923df82d681aca666ad85835945d1',1,'initializeContextFromD3D11Device()(Global Namespace)']]], - ['initializecontextfromdirect3ddevice9_319',['initializeContextFromDirect3DDevice9',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga763e240e3ae405e0140198941bd0dcee',1,'cv::directx::ocl::initializeContextFromDirect3DDevice9()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga763e240e3ae405e0140198941bd0dcee',1,'initializeContextFromDirect3DDevice9()(Global Namespace)']]], - ['initializecontextfromdirect3ddevice9ex_320',['initializeContextFromDirect3DDevice9Ex',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#gaf945f3411355162d7de85f842c752add',1,'cv::directx::ocl::initializeContextFromDirect3DDevice9Ex()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#gaf945f3411355162d7de85f842c752add',1,'initializeContextFromDirect3DDevice9Ex()(Global Namespace)']]], - ['initializecontextfromgl_321',['initializeContextFromGL',['https://docs.opencv.org/4.2.0/d1/d36/namespacecv_1_1ogl_1_1ocl.html#a41441ed4320bfc507d81c5e2cbc41233',1,'cv::ogl::ocl']]], - ['initializecontextfromhandle_322',['initializeContextFromHandle',['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a4f09f3d6c49131f686272677278f0851',1,'cv::ocl::Context::initializeContextFromHandle'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#a4f09f3d6c49131f686272677278f0851',1,'cv::ocl::Platform::initializeContextFromHandle'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga497674e2f118f367b2fa4decbcdecb15',1,'cv::ocl::initializeContextFromHandle()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga497674e2f118f367b2fa4decbcdecb15',1,'initializeContextFromHandle()(Global Namespace)']]], - ['initializecontextfromva_323',['initializeContextFromVA',['https://docs.opencv.org/4.2.0/df/df8/namespacecv_1_1va__intel_1_1ocl.html#ac587480336705517740ed6fc734d75c8',1,'cv::va_intel::ocl']]], - ['initializemask_324',['initializeMask',['https://docs.opencv.org/4.2.0/d6/dfb/classcv_1_1BaseCascadeClassifier_1_1MaskGenerator.html#a9c3e42721d7217d91f6a039fb9ca4181',1,'cv::BaseCascadeClassifier::MaskGenerator']]], - ['initializer_5flist_325',['initializer_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01663.html',1,'std::initializer_list< _E >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00029.html',1,'(Global Namespace)']]], - ['initializer_5flist_5ft_326',['initializer_list_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac569f292a070dfd2f6b69c16e746095a.html#ac569f292a070dfd2f6b69c16e746095a',1,'nlohmann::basic_json']]], - ['initializestereocalibration_327',['initializeStereoCalibration',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a2d7b8bdafac8a51c8b3ff2a7038fb5c5',1,'cv::omnidir::internal']]], - ['initialvalue_328',['initialValue',['https://docs.opencv.org/4.2.0/da/dad/structcv_1_1cudev_1_1Avg.html#ab9cc97494beba0a82139a3d145887bb6',1,'cv::cudev::Avg::initialValue()'],['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1cudev_1_1Max.html#a2b4d2bef95975274383029988ae6fea9',1,'cv::cudev::Max::initialValue()'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1Min.html#aeff4aea67655d22a826f5a6ed642b522',1,'cv::cudev::Min::initialValue()'],['https://docs.opencv.org/4.2.0/d8/d60/structcv_1_1cudev_1_1Sum.html#a447f0dc40f45b77635d8e87a144b9e18',1,'cv::cudev::Sum::initialValue()']]], - ['initimpl_329',['initImpl',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ace2f85404fb03491e9a36bc6ba595e97',1,'cv::superres::SuperResolution::initImpl()'],['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a75432dee954b2f6886f41f057348ac38',1,'cv::Tracker::initImpl()']]], - ['initinfengine_330',['initInfEngine',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a12e3a5730c04d9eb3944883bfe94ed4a',1,'cv::dnn::Layer']]], - ['initinrad_331',['initInRad',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a3af23327d804a96f4a0250b07c2510d5',1,'cv::TrackerSamplerCSC::Params']]], - ['initmaxnegnum_332',['initMaxNegNum',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a7a601f12984ead5da07d9d4a37d12182',1,'cv::TrackerSamplerCSC::Params']]], - ['initmotor_333',['initMotor',['../namespacecan_1_1motor.html#aed6d24cbbf89da0bb3eb1dc11bc8b72e',1,'can::motor']]], - ['initngraph_334',['initNgraph',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#aff6da8252d3558dbb23251b035aff5f6',1,'cv::dnn::Layer']]], - ['initpotentiometer_335',['initPotentiometer',['../namespacecan_1_1motor.html#a7831a61147dcf3f0a72e80878ae13bfa',1,'can::motor']]], - ['initshape_5fn_336',['initShape_n',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a018a08825953d5ee1ee41395fc6d520b',1,'cv::face::FacemarkLBF::Params']]], - ['initstream_337',['initStream',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#af4edbcdb9f9c421b0909f02e01a636c8',1,'cv::AVIReadContainer::initStream(const String &filename)'],['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a9f5a144ae2c2895500eb815c6ccdc722',1,'cv::AVIReadContainer::initStream(Ptr< VideoInputStream > m_file_stream_)']]], - ['initundistortrectifymap_338',['initUndistortRectifyMap',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga7dfb72c9cf9780a347fbe3d1c47e5d5a',1,'cv::initUndistortRectifyMap()'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga0d37b45f780b32f63ed19c21aa9fd333',1,'cv::fisheye::initUndistortRectifyMap()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga0d0b216ff9c9c2cee1ab9cc13cc20faa',1,'cv::omnidir::initUndistortRectifyMap()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga7dfb72c9cf9780a347fbe3d1c47e5d5a',1,'initUndistortRectifyMap(InputArray cameraMatrix, InputArray distCoeffs, InputArray R, InputArray newCameraMatrix, Size size, int m1type, OutputArray map1, OutputArray map2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga0d37b45f780b32f63ed19c21aa9fd333',1,'initUndistortRectifyMap(InputArray K, InputArray D, InputArray R, InputArray P, const cv::Size &size, int m1type, OutputArray map1, OutputArray map2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga0d0b216ff9c9c2cee1ab9cc13cc20faa',1,'initUndistortRectifyMap(InputArray K, InputArray D, InputArray xi, InputArray R, InputArray P, const cv::Size &size, int mltype, OutputArray map1, OutputArray map2, int flags)(Global Namespace)']]], - ['initvkcom_339',['initVkCom',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a95515bef8a2b8525248c1d7588c672be',1,'cv::dnn::Layer']]], - ['initwideangleprojmap_340',['initWideAngleProjMap',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga9185f4fbe1ad74af2c56a392393cf9f4',1,'cv::initWideAngleProjMap(InputArray cameraMatrix, InputArray distCoeffs, Size imageSize, int destImageWidth, int m1type, OutputArray map1, OutputArray map2, enum UndistortTypes projType=PROJ_SPHERICAL_EQRECT, double alpha=0)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gacc07e561972abd7dcfe4a3dc00b7bb8b',1,'cv::initWideAngleProjMap(InputArray cameraMatrix, InputArray distCoeffs, Size imageSize, int destImageWidth, int m1type, OutputArray map1, OutputArray map2, int projType, double alpha=0)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga9185f4fbe1ad74af2c56a392393cf9f4',1,'initWideAngleProjMap(InputArray cameraMatrix, InputArray distCoeffs, Size imageSize, int destImageWidth, int m1type, OutputArray map1, OutputArray map2, enum UndistortTypes projType=PROJ_SPHERICAL_EQRECT, double alpha=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gacc07e561972abd7dcfe4a3dc00b7bb8b',1,'initWideAngleProjMap(InputArray cameraMatrix, InputArray distCoeffs, Size imageSize, int destImageWidth, int m1type, OutputArray map1, OutputArray map2, int projType, double alpha=0)(Global Namespace)']]], - ['initwithparentview_3a_341',['initWithParentView:',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a45844ae7e6af93e3dcaa97aae70e5cf8',1,'CvAbstractCamera']]], - ['inliers_5fmask_342',['inliers_mask',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#a6ff92ca46d2d3f23a80a0bd4303e356f',1,'cv::detail::MatchesInfo']]], - ['inline_343',['InLine',['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#a45f9a5dcce9ba46408e5682bffef1d1d',1,'cv::gapi::fluid::View']]], - ['inlineb_344',['InLineB',['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#a5d71fe1063a955ed7d1b8c3bfed93a54',1,'cv::gapi::fluid::View']]], - ['inmat_345',['inMat',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#a13cc322f7ec86270d7cb72466c29c910',1,'cv::GCPUContext::inMat()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a782ca6fe7ba966201c558fc837845c22',1,'cv::GOCLContext::inMat()']]], - ['inner_346',['inner',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ab827ee701f5ccbd8f9bdeb32497df572',1,'Eigen::Stride::inner()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ab827ee701f5ccbd8f9bdeb32497df572',1,'Stride< 0, Value >::inner()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ab827ee701f5ccbd8f9bdeb32497df572',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::inner()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ab827ee701f5ccbd8f9bdeb32497df572',1,'Stride< Value, 0 >::inner()']]], - ['inner_5fproduct_347',['inner_product',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga721f223f1581a1054b7f55c4b456dd57',1,'std::inner_product(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _Tp __init)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga20b37d44d13d779f7eab4a1ac98ca674',1,'std::inner_product(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _Tp __init, _BinaryOperation1 __binary_op1, _BinaryOperation2 __binary_op2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga721f223f1581a1054b7f55c4b456dd57',1,'inner_product(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _Tp __init)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga20b37d44d13d779f7eab4a1ac98ca674',1,'inner_product(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _Tp __init, _BinaryOperation1 __binary_op1, _BinaryOperation2 __binary_op2)(Global Namespace)']]], - ['innerindexptr_348',['innerIndexPtr',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'Eigen::SparseCompressedBase::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'Eigen::SparseCompressedBase::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< Derived >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< Derived >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< Transpose< MatrixType > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< Transpose< MatrixType > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#ab044564756f472877b2c1a5706e540e2',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html#af5cd1f13dde8578eb9891a4ac4a11977',1,'Eigen::SparseMapBase< Derived, WriteAccessors >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a8e9ef5d399d36fdd860ad05cb7a31455',1,'Eigen::SparseMatrix::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae7b804bd39745156d20ca1611a296b67',1,'Eigen::SparseMatrix::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a8e9ef5d399d36fdd860ad05cb7a31455',1,'SparseMatrix< Scalar >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae7b804bd39745156d20ca1611a296b67',1,'SparseMatrix< Scalar >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a8e9ef5d399d36fdd860ad05cb7a31455',1,'SparseMatrix< Scalar, ColMajor, int >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae7b804bd39745156d20ca1611a296b67',1,'SparseMatrix< Scalar, ColMajor, int >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a8e9ef5d399d36fdd860ad05cb7a31455',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae7b804bd39745156d20ca1611a296b67',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a8e9ef5d399d36fdd860ad05cb7a31455',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae7b804bd39745156d20ca1611a296b67',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::innerIndexPtr() const']]], - ['innernonzeroptr_349',['innerNonZeroPtr',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'Eigen::SparseCompressedBase::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'Eigen::SparseCompressedBase::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< Derived >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< Derived >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< Transpose< MatrixType > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< Transpose< MatrixType > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a2b35a1d701d6c6ea36b2d9f19660a68c',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html#af877ea4e285a4497f80987fea66f7459',1,'Eigen::SparseMapBase< Derived, WriteAccessors >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a00efb5c30c29bbc826d156d97e60d870',1,'Eigen::SparseMatrix::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a218204b051a24f579c394454786eeda0',1,'Eigen::SparseMatrix::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a00efb5c30c29bbc826d156d97e60d870',1,'SparseMatrix< Scalar >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a218204b051a24f579c394454786eeda0',1,'SparseMatrix< Scalar >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a00efb5c30c29bbc826d156d97e60d870',1,'SparseMatrix< Scalar, ColMajor, int >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a218204b051a24f579c394454786eeda0',1,'SparseMatrix< Scalar, ColMajor, int >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a00efb5c30c29bbc826d156d97e60d870',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a218204b051a24f579c394454786eeda0',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a00efb5c30c29bbc826d156d97e60d870',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a218204b051a24f579c394454786eeda0',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::innerNonZeroPtr() const']]], - ['innerparameters_350',['InnerParameters',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html',1,'cv::DetectionBasedTracker::InnerParameters'],['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a662f0418b8db17892b95a5f87ce35c99',1,'cv::DetectionBasedTracker::InnerParameters::InnerParameters()']]], - ['innerparameters_351',['innerParameters',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ad8a9583eced7508072d910188c97f4bf',1,'cv::DetectionBasedTracker']]], - ['innerproductlayer_352',['InnerProductLayer',['https://docs.opencv.org/4.2.0/d0/dc7/classcv_1_1dnn_1_1InnerProductLayer.html',1,'cv::dnn']]], - ['innersize_353',['innerSize',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58ca41d9635a8ab3c5a268ef3f7f0d75',1,'Eigen::DenseBase::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58ca41d9635a8ab3c5a268ef3f7f0d75',1,'DenseBase< ArrayWrapper< ExpressionType > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58ca41d9635a8ab3c5a268ef3f7f0d75',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58ca41d9635a8ab3c5a268ef3f7f0d75',1,'DenseBase< Solve< Decomposition, RhsType > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a0df6dba8d71e0fb15b2995510853f83e',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0f42824d4a06ee1d1f6afbc4551c5896',1,'Eigen::SparseMatrix::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0f42824d4a06ee1d1f6afbc4551c5896',1,'SparseMatrix< Scalar >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0f42824d4a06ee1d1f6afbc4551c5896',1,'SparseMatrix< Scalar, ColMajor, int >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0f42824d4a06ee1d1f6afbc4551c5896',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0f42824d4a06ee1d1f6afbc4551c5896',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a180fcba1ccf3cdf3252a263bc1de7a1d',1,'Eigen::SparseMatrixBase::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a180fcba1ccf3cdf3252a263bc1de7a1d',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a180fcba1ccf3cdf3252a263bc1de7a1d',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a180fcba1ccf3cdf3252a263bc1de7a1d',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a180fcba1ccf3cdf3252a263bc1de7a1d',1,'SparseMatrixBase< Transpose< MatrixType > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a180fcba1ccf3cdf3252a263bc1de7a1d',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::innerSize()']]], - ['innerstride_354',['InnerStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1InnerStride.html',1,'Eigen']]], - ['innerstride_355',['innerStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#a8b17f1bcdb474072e079bb1a7926ef7f',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::innerStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#a4e94e17926e1cf597deb2928e779cef6',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::innerStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#ad3252106d7e004d3410238cab92e3258',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::innerStride()']]], - ['inpaint_356',['inpaint',['https://docs.opencv.org/4.2.0/d1/dc6/classcv_1_1videostab_1_1ColorAverageInpainter.html#a7bf533cc935a428ff95f1cdae2416b91',1,'cv::videostab::ColorAverageInpainter::inpaint()'],['https://docs.opencv.org/4.2.0/d3/d2b/classcv_1_1videostab_1_1ColorInpainter.html#af1bd2c6dcd4c69fcc9202d4fda364e94',1,'cv::videostab::ColorInpainter::inpaint()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1videostab_1_1ConsistentMosaicInpainter.html#a1c7d7469200ede9d31eda981d28c6581',1,'cv::videostab::ConsistentMosaicInpainter::inpaint()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#aa3a1cba9518b2afbad928859b073ad93',1,'cv::videostab::InpainterBase::inpaint()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a2461fddc037a498cabfaf6cd32f25ece',1,'cv::videostab::InpaintingPipeline::inpaint()'],['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#ae84c8c9f0a5d18bf44e2f4c11b547aa0',1,'cv::videostab::MotionInpainter::inpaint()'],['https://docs.opencv.org/4.2.0/d4/d1d/classcv_1_1videostab_1_1NullInpainter.html#ac61df81a5ccea0f8595b73954650da52',1,'cv::videostab::NullInpainter::inpaint()'],['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html#gaedd30dfa0214fec4c88138b51d678085',1,'cv::inpaint()'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga62fa7703db24939ad65d7a799e8e599e',1,'cv::ft::inpaint()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gab4febba6be53e5fddc480b8cedf51eee',1,'cv::xphoto::inpaint()'],['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html#gaedd30dfa0214fec4c88138b51d678085',1,'inpaint(InputArray src, InputArray inpaintMask, OutputArray dst, double inpaintRadius, int flags)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga62fa7703db24939ad65d7a799e8e599e',1,'inpaint(InputArray image, InputArray mask, OutputArray output, int radius, int function, int algorithm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gab4febba6be53e5fddc480b8cedf51eee',1,'inpaint(const Mat &src, const Mat &mask, Mat &dst, const int algorithmType)(Global Namespace)']]], - ['inpaint_5ffsr_5fbest_357',['INPAINT_FSR_BEST',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ggaac254ca51291f930a86502adc834a87dab95b58c30e74bb1dd6ad77fa5d75140b',1,'cv::xphoto::INPAINT_FSR_BEST'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ggaac254ca51291f930a86502adc834a87dab95b58c30e74bb1dd6ad77fa5d75140b',1,'INPAINT_FSR_BEST(Global Namespace)']]], - ['inpaint_5ffsr_5ffast_358',['INPAINT_FSR_FAST',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ggaac254ca51291f930a86502adc834a87daedfca54293916a29f9e3bca4e780c520',1,'cv::xphoto::INPAINT_FSR_FAST'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ggaac254ca51291f930a86502adc834a87daedfca54293916a29f9e3bca4e780c520',1,'INPAINT_FSR_FAST(Global Namespace)']]], - ['inpaint_5fns_359',['INPAINT_NS',['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html#gga45962890a6f4f2e921922f4db5e29b92a05e763003a805e6c11c673a9f4ba7d07',1,'cv::INPAINT_NS'],['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html#gga45962890a6f4f2e921922f4db5e29b92a05e763003a805e6c11c673a9f4ba7d07',1,'INPAINT_NS(Global Namespace)']]], - ['inpaint_5fshiftmap_360',['INPAINT_SHIFTMAP',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ggaac254ca51291f930a86502adc834a87da4e1f6f6e76837e282aff24dc73f97bf3',1,'cv::xphoto::INPAINT_SHIFTMAP'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ggaac254ca51291f930a86502adc834a87da4e1f6f6e76837e282aff24dc73f97bf3',1,'INPAINT_SHIFTMAP(Global Namespace)']]], - ['inpaint_5ftelea_361',['INPAINT_TELEA',['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html#gga45962890a6f4f2e921922f4db5e29b92a892824c38e258feb5e72f308a358d52e',1,'cv::INPAINT_TELEA'],['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html#gga45962890a6f4f2e921922f4db5e29b92a892824c38e258feb5e72f308a358d52e',1,'INPAINT_TELEA(Global Namespace)']]], - ['inpainter_362',['inpainter',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#afe5046c6efef3aef80125d7d61a4dab1',1,'cv::videostab::StabilizerBase']]], - ['inpainter_5f_363',['inpainter_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aa6997fb6ae1915a8df3c0d7f58f7ed8b',1,'cv::videostab::StabilizerBase']]], - ['inpainterbase_364',['InpainterBase',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html',1,'cv::videostab::InpainterBase'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a74429e890d897eb24d38087b253ea727',1,'cv::videostab::InpainterBase::InpainterBase()']]], - ['inpainting_365',['Inpainting',['https://docs.opencv.org/4.2.0/df/d3d/tutorial_py_inpainting.html',1,'Image Inpainting'],['https://docs.opencv.org/4.2.0/dc/d2f/tutorial_xphoto_inpainting.html',1,'Image Inpainting'],['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html',1,'Inpainting']]], - ['inpainting_20using_20f_20transform_366',['Inpainting using F-transform',['https://docs.opencv.org/4.2.0/d3/db8/tutorial_fuzzy_inpainting.html',1,'']]], - ['inpainting_2ehpp_367',['inpainting.hpp',['https://docs.opencv.org/4.2.0/dc/dc7/videostab_2include_2opencv2_2videostab_2inpainting_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d72/xphoto_2include_2opencv2_2xphoto_2inpainting_8hpp.html',1,'(Global Namespace)']]], - ['inpainting_2emarkdown_368',['inpainting.markdown',['https://docs.opencv.org/4.2.0/d0/d0f/inpainting_8markdown.html',1,'']]], - ['inpaintingmask_5f_369',['inpaintingMask_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a8e07199a116143e55c3566c722350b93',1,'cv::videostab::StabilizerBase']]], - ['inpaintingpipeline_370',['InpaintingPipeline',['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html',1,'cv::videostab']]], - ['inpainttypes_371',['InpaintTypes',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gaac254ca51291f930a86502adc834a87d',1,'cv::xphoto::InpaintTypes'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gaac254ca51291f930a86502adc834a87d',1,'InpaintTypes(Global Namespace)']]], - ['inplace_20matrix_20decompositions_372',['Inplace matrix decompositions',['https://eigen.tuxfamily.org/dox/group__InplaceDecomposition.html',1,'']]], - ['inplace_5fmerge_373',['inplace_merge',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga5e5479e1ac5e92b0c1f77bcf762d07e9',1,'std::inplace_merge(_BidirectionalIterator __first, _BidirectionalIterator __middle, _BidirectionalIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaf6a8379ab8a648fd05d52ed0632081fa',1,'std::inplace_merge(_BidirectionalIterator __first, _BidirectionalIterator __middle, _BidirectionalIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga5e5479e1ac5e92b0c1f77bcf762d07e9',1,'inplace_merge(_BidirectionalIterator __first, _BidirectionalIterator __middle, _BidirectionalIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaf6a8379ab8a648fd05d52ed0632081fa',1,'inplace_merge(_BidirectionalIterator __first, _BidirectionalIterator __middle, _BidirectionalIterator __last, _Compare __comp)(Global Namespace)']]], - ['input_20and_20output_20imgcodecs_20module_374',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], - ['input_20and_20output_20using_20xml_20and_20yaml_20files_375',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], - ['input_20and_20output_20videoio_20module_376',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], - ['input_20output_377',['Input/Output',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html',1,'']]], - ['input_20with_20opencv_20and_20similarity_20measurement_378',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], - ['input_5fformat_5ft_379',['input_format_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a211cf53702226ad9fb3c939a3a3d3689.html#a211cf53702226ad9fb3c939a3a3d3689',1,'nlohmann::basic_json']]], - ['input_5fiterator_5ftag_380',['input_iterator_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07691.html',1,'std']]], - ['input_5fnames_381',['input_names',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#af23f13d4a2063df67603b64941af4cc3',1,'cv::gapi::ie::detail::ParamDesc']]], - ['inputarray_382',['InputArray',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga353a9de602fe76c709e12074a6f362ba',1,'cv::InputArray'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga353a9de602fe76c709e12074a6f362ba',1,'InputArray(Global Namespace)']]], - ['inputarrayofarrays_383',['InputArrayOfArrays',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga606feabe3b50ab6838f1ba89727aa07a',1,'cv::InputArrayOfArrays'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga606feabe3b50ab6838f1ba89727aa07a',1,'InputArrayOfArrays(Global Namespace)']]], - ['inputnametoindex_384',['inputNameToIndex',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a93212cf0fe50ace40af0f2b4f42263c4',1,'cv::dnn::Layer::inputNameToIndex()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a65ab14f117c7086b23e3429f50d6866e',1,'cv::dnn::LSTMLayer::inputNameToIndex()']]], - ['inputoutputarray_385',['InputOutputArray',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf77c9a14ef956c50c1efd4547f444e63',1,'cv::InputOutputArray'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf77c9a14ef956c50c1efd4547f444e63',1,'InputOutputArray(Global Namespace)']]], - ['inputoutputarrayofarrays_386',['InputOutputArrayOfArrays',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8899575c0929a56ab8bdd01cf34ebcb1',1,'cv::InputOutputArrayOfArrays'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8899575c0929a56ab8bdd01cf34ebcb1',1,'InputOutputArrayOfArrays(Global Namespace)']]], - ['inrange_387',['inRange',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga48af0ab51e36436c5d04340e036ce981',1,'cv::inRange()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga76246465115220c5e5986a55298300c7',1,'cv::gapi::inRange()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga48af0ab51e36436c5d04340e036ce981',1,'inRange(InputArray src, InputArray lowerb, InputArray upperb, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga76246465115220c5e5986a55298300c7',1,'inRange(const GMat &src, const GScalar &threshLow, const GScalar &threshUp)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d97/tutorial_threshold_inRange.html',1,'Thresholding Operations using inRange']]], - ['insert_388',['insert',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a18a6c9999210d769538297d843c613f2',1,'cv::Subdiv2D::insert(Point2f pt)'],['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a37223a499032ef57364f1372ad0c9c2e',1,'cv::Subdiv2D::insert(const std::vector< Point2f > &ptvec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae2330468c2acd43907a611293334baf0',1,'__gnu_cxx::__versa_string::insert(const_iterator __p, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9f4193d5c08023732ca08b2e3b069b55',1,'__gnu_cxx::__versa_string::insert(const_iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a801fdd1dc9aaa55ef858fcf5414ae385',1,'__gnu_cxx::__versa_string::insert(const_iterator __p, std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a3f98b8577d9a4c1a9d01216e4c308136',1,'__gnu_cxx::__versa_string::insert(size_type __pos1, const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a5a80f90cbf0f3913738a1480b3a1bd86',1,'__gnu_cxx::__versa_string::insert(size_type __pos1, const __versa_string &__str, size_type __pos2, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a90943cd50dde194d35e6efb62165a53d',1,'__gnu_cxx::__versa_string::insert(size_type __pos, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a99de3540d81c73d650f605329019a161',1,'__gnu_cxx::__versa_string::insert(size_type __pos, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2f59bd59e348597a85efa6b068013b33',1,'__gnu_cxx::__versa_string::insert(size_type __pos, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a11bac87efc12b1fc97b0508ce66a4eff',1,'__gnu_cxx::__versa_string::insert(const_iterator __p, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'__gnu_debug::basic_string::insert(iterator __p, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'__gnu_debug::basic_string::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'__gnu_debug::basic_string::insert(iterator __p, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'__gnu_debug::basic_string::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'__gnu_debug::basic_string::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'__gnu_debug::basic_string::insert(iterator __p, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< _CharT >::insert(iterator __p, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< _CharT >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< _CharT >::insert(iterator __p, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< _CharT >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< _CharT >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< _CharT >::insert(size_type __pos, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< _CharT >::insert(size_type __pos, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< _CharT >::insert(size_type __pos, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< _CharT >::insert(iterator __p, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< _CharT, _Traits, _Allocator >::insert(iterator __p, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< _CharT, _Traits, _Allocator >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< _CharT, _Traits, _Allocator >::insert(iterator __p, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< _CharT, _Traits, _Allocator >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< _CharT, _Traits, _Allocator >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< _CharT, _Traits, _Allocator >::insert(size_type __pos, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< _CharT, _Traits, _Allocator >::insert(size_type __pos, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< _CharT, _Traits, _Allocator >::insert(size_type __pos, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< _CharT, _Traits, _Allocator >::insert(iterator __p, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(iterator __p, size_type __n, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(iterator __p, initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(size_type __pos, const _Elem *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(size_type __pos, const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(size_type __pos, size_type __n, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(iterator __p, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< char >::insert(iterator __p, size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< char >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< char >::insert(iterator __p, initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< char >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< char >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< char >::insert(size_type __pos, const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< char >::insert(size_type __pos, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< char >::insert(size_type __pos, size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< char >::insert(iterator __p, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(iterator __p, size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(iterator __p, initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(size_type __pos, const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(size_type __pos, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(size_type __pos, size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(iterator __p, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< char_type, _Traits, _Alloc >::insert(iterator __p, size_type __n, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< char_type, _Traits, _Alloc >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< char_type, _Traits, _Alloc >::insert(iterator __p, initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< char_type, _Traits, _Alloc >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< char_type, _Traits, _Alloc >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< char_type, _Traits, _Alloc >::insert(size_type __pos, const char_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< char_type, _Traits, _Alloc >::insert(size_type __pos, const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< char_type, _Traits, _Alloc >::insert(size_type __pos, size_type __n, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< char_type, _Traits, _Alloc >::insert(iterator __p, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< value_type >::insert(iterator __p, size_type __n, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< value_type >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< value_type >::insert(iterator __p, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< value_type >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< value_type >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< value_type >::insert(size_type __pos, const value_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< value_type >::insert(size_type __pos, const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< value_type >::insert(size_type __pos, size_type __n, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< value_type >::insert(iterator __p, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a69b4ca4a5aad67e979d6e6db9b31781a',1,'deque< _StateSeqT >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#adec6ee2ba1f059f0addf6b9da5b596e1',1,'deque< _StateSeqT >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a755a6d05ef2270de50ce270bea77250f',1,'deque< _StateSeqT >::insert(const_iterator __p, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ad645c0144212cbfee911daa80578e997',1,'deque< _StateSeqT >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#aee2b0dd83e2d5c82db3b2df6918e484a',1,'deque< _StateSeqT >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a0b44f76b96a458895a1e8c6e4057b8dd',1,'list< __inp, __rebind_inp >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a2b70528dcf0f77ddb45429d463de07e4',1,'list< __inp, __rebind_inp >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#af9214e29cd05b8446678285415fb6f1e',1,'list< __inp, __rebind_inp >::insert(const_iterator __p, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3660a3d042a5605cde9ecc59e4b9b17c',1,'list< __inp, __rebind_inp >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a9a552f1f8f2fd43351184e6676b1fea1',1,'list< __inp, __rebind_inp >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'match_results< _Bi_iter >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'match_results< _Bi_iter >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'match_results< _Bi_iter >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'match_results< _Bi_iter >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'match_results< _Bi_iter >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'std::basic_string::insert(iterator __p, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'std::basic_string::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'std::basic_string::insert(iterator __p, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'std::basic_string::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'std::basic_string::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'std::basic_string::insert(size_type __pos, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'std::basic_string::insert(size_type __pos, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'std::basic_string::insert(size_type __pos, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'std::basic_string::insert(iterator __p, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a69b4ca4a5aad67e979d6e6db9b31781a',1,'std::deque::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#adec6ee2ba1f059f0addf6b9da5b596e1',1,'std::deque::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a755a6d05ef2270de50ce270bea77250f',1,'std::deque::insert(const_iterator __p, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ad645c0144212cbfee911daa80578e997',1,'std::deque::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#aee2b0dd83e2d5c82db3b2df6918e484a',1,'std::deque::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a0b44f76b96a458895a1e8c6e4057b8dd',1,'std::list::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a2b70528dcf0f77ddb45429d463de07e4',1,'std::list::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#af9214e29cd05b8446678285415fb6f1e',1,'std::list::insert(const_iterator __p, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3660a3d042a5605cde9ecc59e4b9b17c',1,'std::list::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a9a552f1f8f2fd43351184e6676b1fea1',1,'std::list::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ab228710aaa8c81fc3b7fe37b26fc709a',1,'std::map::insert(std::initializer_list< value_type > __list)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a3186e7576e4ffc474fd92f66e460d231',1,'std::map::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a3a5341d2ce3f2ffa4426d29110ca8e41',1,'std::map::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a94b8084648ff490a86c7cf951f537a37',1,'std::map::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ad95452a6c3677b7176b6b8e3d24e9176',1,'std::map::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#aa0d825fbc11a62dc06420646e0c90dd5',1,'std::map::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a99ddc0c2cfe1d8a8cac10a2b59207c68',1,'std::map::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a9296f57a3c7c517446504a256dcc48de',1,'std::map::insert(const_iterator __position, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a3a5341d2ce3f2ffa4426d29110ca8e41',1,'std::map::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a94b8084648ff490a86c7cf951f537a37',1,'std::map::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ad95452a6c3677b7176b6b8e3d24e9176',1,'std::map::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#aa0d825fbc11a62dc06420646e0c90dd5',1,'std::map::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a99ddc0c2cfe1d8a8cac10a2b59207c68',1,'std::map::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a9296f57a3c7c517446504a256dcc48de',1,'std::map::insert(const_iterator __position, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'std::match_results::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'std::match_results::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'std::match_results::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'std::match_results::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'std::match_results::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a36587a799aa76b39df686435ed846cd1',1,'std::multimap::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a051e304a855790e3be5171f64196b7b6',1,'std::multimap::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ab73db27102f8da23a1aa18ae7b14d2c1',1,'std::multimap::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a7daafbe374e255fcb4e044e75e1c4b1a',1,'std::multimap::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a0fa7a92b05bab64bac54cd6eb322a50c',1,'std::multimap::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ae496df8209ddbbf8f661a469f7624ddb',1,'std::multimap::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1b3bf0fd80e918b53b3be7cf135dca87',1,'std::multimap::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#abc8aea1bb476f6913ffe1afbdd29178b',1,'std::multimap::insert(const_iterator __position, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ab73db27102f8da23a1aa18ae7b14d2c1',1,'std::multimap::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a7daafbe374e255fcb4e044e75e1c4b1a',1,'std::multimap::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a0fa7a92b05bab64bac54cd6eb322a50c',1,'std::multimap::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ae496df8209ddbbf8f661a469f7624ddb',1,'std::multimap::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1b3bf0fd80e918b53b3be7cf135dca87',1,'std::multimap::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#abc8aea1bb476f6913ffe1afbdd29178b',1,'std::multimap::insert(const_iterator __position, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a6a95194c5c1aa0caf2d2f852def99bfc',1,'std::multiset::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ad039dc1cb5c117a62ab8ff56fef14a22',1,'std::multiset::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a7229e1145054a27d23f88a185085f7ec',1,'std::multiset::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a70689e1641f42b649d8237b0c6ba6592',1,'std::multiset::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af168dfb4d8e0515557884b2619117c78',1,'std::set::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#abe856758e09628d4ec26d1e77ceee152',1,'std::set::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aa383fd1111f8ced96c22eacf1e42c258',1,'std::set::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a555b9e2cf15a4d3aac095883904743a8',1,'std::set::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0c40f8641ff4ca47fe2998a46404cf37',1,'std::unordered_map::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a191d1d95c2d102dc1057677df000aaec',1,'std::unordered_map::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a047d2b3433747276ee6daa9eba154295',1,'std::unordered_map::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adb80cc201b9b5b821e8ef73492106db3',1,'std::unordered_map::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aae182defe617c8d37e27b27b09277ea9',1,'std::unordered_map::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3eb7753105411145e2d8476cf300b348',1,'std::unordered_map::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a01d23be5cd83c13117d269bc1df1488f',1,'std::unordered_map::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae4f015606d8e138c72eb87ce5f89ed50',1,'std::unordered_map::insert(const_iterator __hint, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a047d2b3433747276ee6daa9eba154295',1,'std::unordered_map::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adb80cc201b9b5b821e8ef73492106db3',1,'std::unordered_map::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aae182defe617c8d37e27b27b09277ea9',1,'std::unordered_map::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3eb7753105411145e2d8476cf300b348',1,'std::unordered_map::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a01d23be5cd83c13117d269bc1df1488f',1,'std::unordered_map::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae4f015606d8e138c72eb87ce5f89ed50',1,'std::unordered_map::insert(const_iterator __hint, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a46f035c31a44c4051965af7868d40e77',1,'std::unordered_multimap::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#acb1935806673ced5dae48aa64d8cabc3',1,'std::unordered_multimap::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a79303f819716015a95be11962dda3e53',1,'std::unordered_multimap::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a73f5c66280686af351a204b1d98774b6',1,'std::unordered_multimap::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ade6cdef7282f352738f0a2bde236cf06',1,'std::unordered_multimap::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aeb4625ec1e0a22af00ccb220e4c7c7b2',1,'std::unordered_multimap::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af90dcd39d44bdeffe788e78ca829d639',1,'std::unordered_multimap::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af7389296b49f59cc5a612fd769daaeeb',1,'std::unordered_multimap::insert(const_iterator __hint, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a79303f819716015a95be11962dda3e53',1,'std::unordered_multimap::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a73f5c66280686af351a204b1d98774b6',1,'std::unordered_multimap::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ade6cdef7282f352738f0a2bde236cf06',1,'std::unordered_multimap::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aeb4625ec1e0a22af00ccb220e4c7c7b2',1,'std::unordered_multimap::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af90dcd39d44bdeffe788e78ca829d639',1,'std::unordered_multimap::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af7389296b49f59cc5a612fd769daaeeb',1,'std::unordered_multimap::insert(const_iterator __hint, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a914954becc1ec4a1bec63eafe11065e1',1,'std::unordered_multiset::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0e45e9fa99b643fb6a79c4154c00dcb4',1,'std::unordered_multiset::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aa8ed787cbd107c6e469d92d0ab4d2836',1,'std::unordered_multiset::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aa888dc9e6ebd2d05342de7efac99e55c',1,'std::unordered_multiset::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0a7ead2d0db3cfaf291968f0967cf242',1,'std::unordered_multiset::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aadc4a113c0ce8991df621858a74e063b',1,'std::unordered_multiset::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aa8ed787cbd107c6e469d92d0ab4d2836',1,'std::unordered_multiset::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aa888dc9e6ebd2d05342de7efac99e55c',1,'std::unordered_multiset::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0a7ead2d0db3cfaf291968f0967cf242',1,'std::unordered_multiset::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aadc4a113c0ce8991df621858a74e063b',1,'std::unordered_multiset::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ab8d7bdf04f958f040cfd842c6e2d7b6b',1,'std::unordered_set::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#adaa06dc3ca7393564cf03ce38cbe5d74',1,'std::unordered_set::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ac9fa0bc82f5e6fae38a8d225f468608d',1,'std::unordered_set::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#abc0147e25845cc780f71f1b14cd41cce',1,'std::unordered_set::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a6b211cbe01ddf94104caf45b393ae933',1,'std::unordered_set::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a9e27a7160d0253be3bc02bf9c2fd4d62',1,'std::unordered_set::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ac9fa0bc82f5e6fae38a8d225f468608d',1,'std::unordered_set::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#abc0147e25845cc780f71f1b14cd41cce',1,'std::unordered_set::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a6b211cbe01ddf94104caf45b393ae933',1,'std::unordered_set::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a9e27a7160d0253be3bc02bf9c2fd4d62',1,'std::unordered_set::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'std::vector::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'std::vector::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'std::vector::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'std::vector::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'std::vector::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0c40f8641ff4ca47fe2998a46404cf37',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a191d1d95c2d102dc1057677df000aaec',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a047d2b3433747276ee6daa9eba154295',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adb80cc201b9b5b821e8ef73492106db3',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aae182defe617c8d37e27b27b09277ea9',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3eb7753105411145e2d8476cf300b348',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a01d23be5cd83c13117d269bc1df1488f',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae4f015606d8e138c72eb87ce5f89ed50',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const_iterator __hint, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a047d2b3433747276ee6daa9eba154295',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adb80cc201b9b5b821e8ef73492106db3',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aae182defe617c8d37e27b27b09277ea9',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3eb7753105411145e2d8476cf300b348',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a01d23be5cd83c13117d269bc1df1488f',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae4f015606d8e138c72eb87ce5f89ed50',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const_iterator __hint, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< __diff_type >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< __diff_type >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< __diff_type >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< __diff_type >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< __diff_type >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _CharClassT >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _CharClassT >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _CharClassT >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _CharClassT >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _CharClassT >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _CharT >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _CharT >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _CharT >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _CharT >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _CharT >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _Cmpt >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _Cmpt >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _Cmpt >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _Cmpt >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _Cmpt >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _Node *, _Nodeptr_Alloc >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _Node *, _Nodeptr_Alloc >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _Node *, _Nodeptr_Alloc >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _Node *, _Nodeptr_Alloc >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _Node *, _Nodeptr_Alloc >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _RealType >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _RealType >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _RealType >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _RealType >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _RealType >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _State< _TraitsT::char_type > >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _State< _TraitsT::char_type > >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _State< _TraitsT::char_type > >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _State< _TraitsT::char_type > >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _State< _TraitsT::char_type > >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _StringT >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _StringT >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _StringT >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _StringT >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _StringT >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< block_type, allocator_type >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< block_type, allocator_type >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< block_type, allocator_type >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< block_type, allocator_type >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< block_type, allocator_type >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< Catalog_info * >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< Catalog_info * >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< Catalog_info * >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< Catalog_info * >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< Catalog_info * >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< double >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< double >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< double >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< double >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< double >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< int >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< int >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< int >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< int >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< int >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< result_type >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< result_type >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< result_type >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< result_type >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< result_type >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< size_t >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< size_t >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< size_t >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< size_t >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< size_t >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< std::pair< _BiIter, int > >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< std::pair< _BiIter, int > >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< std::pair< _BiIter, int > >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< std::pair< _BiIter, int > >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< std::pair< _BiIter, int > >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< std::pair< _StateIdT, std::vector > >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< std::pair< _StateIdT, std::vector > >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< std::pair< _StateIdT, std::vector > >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< std::pair< _StateIdT, std::vector > >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< std::pair< _StateIdT, std::vector > >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< std::pair< _StrTransT, _StrTransT > >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< std::pair< _StrTransT, _StrTransT > >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< std::pair< _StrTransT, _StrTransT > >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< std::pair< _StrTransT, _StrTransT > >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< std::pair< _StrTransT, _StrTransT > >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< sub_match< _Bi_iter >, _Alloc >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< sub_match< _Bi_iter >, _Alloc >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< sub_match< _Bi_iter >, _Alloc >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< sub_match< _Bi_iter >, _Alloc >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< sub_match< _Bi_iter >, _Alloc >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< sub_match< _BiIter >, _Alloc >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< sub_match< _BiIter >, _Alloc >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< sub_match< _BiIter >, _Alloc >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< sub_match< _BiIter >, _Alloc >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< sub_match< _BiIter >, _Alloc >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aae45e3b5fec7f6a0cdd10eec7c6d3666',1,'Eigen::SparseMatrix::insert()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aae45e3b5fec7f6a0cdd10eec7c6d3666',1,'SparseMatrix< Scalar >::insert()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aae45e3b5fec7f6a0cdd10eec7c6d3666',1,'SparseMatrix< Scalar, ColMajor, int >::insert()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aae45e3b5fec7f6a0cdd10eec7c6d3666',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::insert()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aae45e3b5fec7f6a0cdd10eec7c6d3666',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::insert()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aeb86e8478e20d95970a8b61ff01dce3b.html#aeb86e8478e20d95970a8b61ff01dce3b',1,'nlohmann::basic_json::insert(const_iterator pos, const basic_json &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9c5b9de8a4a759861cb600b38a6c81b1.html#a9c5b9de8a4a759861cb600b38a6c81b1',1,'nlohmann::basic_json::insert(const_iterator pos, basic_json &&val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a71e197e6cc78c3960011f68a75f8ef22.html#a71e197e6cc78c3960011f68a75f8ef22',1,'nlohmann::basic_json::insert(const_iterator pos, size_type cnt, const basic_json &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a8137d5471edcd71606e42155ed9c23e2.html#a8137d5471edcd71606e42155ed9c23e2',1,'nlohmann::basic_json::insert(const_iterator pos, const_iterator first, const_iterator last)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a856b8764efd21dac4205a00fec82e09a.html#a856b8764efd21dac4205a00fec82e09a',1,'nlohmann::basic_json::insert(const_iterator pos, initializer_list_t ilist)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0181d03c6314bedcbad2e92d3676223c.html#a0181d03c6314bedcbad2e92d3676223c',1,'nlohmann::basic_json::insert(const_iterator first, const_iterator last)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a0241433138719e477a3cbb0c4cf0a243.html#a0241433138719e477a3cbb0c4cf0a243',1,'nlohmann::ordered_map::insert(const value_type &value)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a2c8509f72bc33307661f1a0ed5763f9e.html#a2c8509f72bc33307661f1a0ed5763f9e',1,'nlohmann::ordered_map::insert(InputIt first, InputIt last)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a48eceff729b80f3f4a023b737efccc5b.html#a48eceff729b80f3f4a023b737efccc5b',1,'nlohmann::ordered_map::insert(value_type &&value)']]], - ['insert_5fafter_389',['insert_after',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a6f8e1063932912fb3e245b7c8116ed1f',1,'std::forward_list::insert_after(const_iterator __pos, const _Tp &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a4921af283fd230d563266ca0ce14a455',1,'std::forward_list::insert_after(const_iterator __pos, size_type __n, const _Tp &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a03cc027e568ad94dbbbc25da7d485fe7',1,'std::forward_list::insert_after(const_iterator __pos, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a9739cbb5af18ac9976288f6c9c072bb0',1,'std::forward_list::insert_after(const_iterator __pos, std::initializer_list< _Tp > __il)']]], - ['insert_5ferror_390',['insert_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11131.html',1,'__gnu_pbds']]], - ['insert_5fiterator_391',['insert_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html',1,'std::insert_iterator< _Container >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a69916dd7c180bcb5fb6874adaaacc08b',1,'std::insert_iterator::insert_iterator()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab5c8034e997c5b852b92bdc6a3f70994.html#ab5c8034e997c5b852b92bdc6a3f70994',1,'nlohmann::basic_json::insert_iterator()']]], - ['insert_5fjoin_5ffn_5fimps_2ehpp_392',['insert_join_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01373.html',1,'']]], - ['insertchannel_393',['insertChannel',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1d4bd886d35b00ec0b764cb4ce6eb515',1,'cv::insertChannel()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1d4bd886d35b00ec0b764cb4ce6eb515',1,'insertChannel()(Global Namespace)']]], - ['inserter_394',['inserter',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga289787d62ed6190c55ce9f2ea65aaa41',1,'std::inserter()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga289787d62ed6190c55ce9f2ea65aaa41',1,'inserter()(Global Namespace)']]], - ['inside_395',['inside',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a48aaacb8db7971b6c42fa2d6717d12eb',1,'cv::Point_::inside()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a48aaacb8db7971b6c42fa2d6717d12eb',1,'Point_< double >::inside()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a48aaacb8db7971b6c42fa2d6717d12eb',1,'Point_< float >::inside()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a48aaacb8db7971b6c42fa2d6717d12eb',1,'Point_< int >::inside()']]], - ['inside_20eigen_20on_20a_20simple_20example_396',['What happens inside Eigen, on a simple example',['https://eigen.tuxfamily.org/dox/TopicInsideEigenExample.html',1,'']]], - ['inside_20the_20microsoft_20visual_20studio_397',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['inside_5fmap_398',['INSIDE_MAP',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ab25ab28a95a47dd9cd9e26e71398dd3fa5f72e3ef09a40bb337ce1729a5df2767',1,'cv::FileStorage']]], - ['inspired_20vision_20models_20and_20derivated_20tools_399',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], - ['install_20opencv_20python_20in_20fedora_400',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], - ['install_20opencv_20python_20in_20ubuntu_401',['Install OpenCV-Python in Ubuntu',['https://docs.opencv.org/4.2.0/d2/de6/tutorial_py_setup_in_ubuntu.html',1,'']]], - ['install_20opencv_20python_20in_20windows_402',['Install OpenCV-Python in Windows',['https://docs.opencv.org/4.2.0/d5/de5/tutorial_py_setup_in_windows.html',1,'']]], - ['install_5ftesseract_2emarkdown_403',['install_tesseract.markdown',['https://docs.opencv.org/4.2.0/de/d5b/install__tesseract_8markdown.html',1,'']]], - ['installation_404',['SFM module installation',['https://docs.opencv.org/4.2.0/db/db8/tutorial_sfm_installation.html',1,'']]], - ['installation_20by_20using_20git_20bash_20version_202_2014_201_20and_20cmake_20version_203_209_201_405',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], - ['installation_20in_20ios_406',['Installation in iOS',['https://docs.opencv.org/4.2.0/d5/da3/tutorial_ios_install.html',1,'']]], - ['installation_20in_20linux_407',['Installation in Linux',['https://docs.opencv.org/4.2.0/d7/d9f/tutorial_linux_install.html',1,'']]], - ['installation_20in_20macos_408',['Installation in MacOS',['https://docs.opencv.org/4.2.0/d0/db2/tutorial_macos_install.html',1,'']]], - ['installation_20in_20windows_409',['Installation in Windows',['https://docs.opencv.org/4.2.0/d3/d52/tutorial_windows_install.html',1,'']]], - ['instrnode_410',['InstrNode',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#af24d8c0b3b5a29011882e54fdbf153a2',1,'cv::instr']]], - ['instrumentation_2ehpp_411',['instrumentation.hpp',['https://docs.opencv.org/4.2.0/df/dab/instrumentation_8hpp.html',1,'']]], - ['int_412',['INT',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a7cc4b29d55327b449bfe110b7e8cb327',1,'cv::FileNode::INT'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa53f93baa3057821107c750323892fa92',1,'INT(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa53f93baa3057821107c750323892fa92',1,'INT(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa53f93baa3057821107c750323892fa92',1,'INT(Global Namespace)']]], - ['int16_5ft_413',['int16_t',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#af4c7df4eb83784f8746e143ee9792ad4',1,'cv']]], - ['int2type_414',['Int2Type',['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1cudev_1_1Int2Type.html',1,'cv::cudev']]], - ['int32_5ft_415',['int32_t',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#ad5ed0491058a71efd30a0f28ad1d3f05',1,'cv']]], - ['int64_416',['int64',['https://docs.opencv.org/4.2.0/d1/d1b/group__core__hal__interface.html#ga7cde0074dfd288f2d70c0e035dacb28a',1,]]], - ['int64_5ft_417',['int64_t',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a206f22cea0deff11cbac113b87afff00',1,'cv']]], - ['int8_5ft_418',['int8_t',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a2666d39ccd0946dda42b71153ef88bcb',1,'cv']]], - ['int_5ftype_419',['int_type',['https://docs.opencv.org/4.2.0/d5/d9e/structcv_1_1V__TypeTraits_3_01double_01_4.html#ab4852bea73da351715c4b9200e7dbed4',1,'cv::V_TypeTraits< double >::int_type'],['https://docs.opencv.org/4.2.0/da/d19/structcv_1_1V__TypeTraits_3_01float_01_4.html#ac8f0f98fd7307f571d4ff79354164f08',1,'cv::V_TypeTraits< float >::int_type'],['https://docs.opencv.org/4.2.0/db/d59/structcv_1_1V__TypeTraits_3_01int64_01_4.html#a0ee2ebea3ba6ed36f96b6c3571c8e1f1',1,'cv::V_TypeTraits< int64 >::int_type'],['https://docs.opencv.org/4.2.0/d0/d9d/structcv_1_1V__TypeTraits_3_01schar_01_4.html#a4cd5cf0766decd547dd4a6a814c1c190',1,'cv::V_TypeTraits< schar >::int_type'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1V__TypeTraits_3_01short_01_4.html#a733cd51b950a427e20c62e648542c92e',1,'cv::V_TypeTraits< short >::int_type'],['https://docs.opencv.org/4.2.0/dd/d1d/structcv_1_1V__TypeTraits_3_01uchar_01_4.html#a7f35670c4800371949376b04741edb67',1,'cv::V_TypeTraits< uchar >::int_type'],['https://docs.opencv.org/4.2.0/d2/d4d/structcv_1_1V__TypeTraits_3_01uint64_01_4.html#a45708076798fd9ad8f8b36287549bd92',1,'cv::V_TypeTraits< uint64 >::int_type'],['https://docs.opencv.org/4.2.0/d3/d8c/structcv_1_1V__TypeTraits_3_01unsigned_01_4.html#aa7f271f65ab399cc17e53a94ad5077e2',1,'cv::V_TypeTraits< unsigned >::int_type'],['https://docs.opencv.org/4.2.0/d6/dd5/structcv_1_1V__TypeTraits_3_01ushort_01_4.html#a8d034ede6d35ff487c59a74a0420f401',1,'cv::V_TypeTraits< ushort >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#abed08c42ca8297417265888a1232709a',1,'basic_ios< char, _Traits >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#abed08c42ca8297417265888a1232709a',1,'basic_ios< char, _Traits >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'basic_streambuf< _Elem, _Tr >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'basic_streambuf< _Elem, _Tr >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'basic_streambuf< char, _Traits >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'basic_streambuf< char, _Traits >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'basic_streambuf< char, char_traits< char > >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'basic_streambuf< char, char_traits< char > >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#abed08c42ca8297417265888a1232709a',1,'std::basic_ios::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#abed08c42ca8297417265888a1232709a',1,'std::basic_ios::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'std::basic_streambuf::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'std::basic_streambuf::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#afb6691f43e173e47ffe52e245a360da1',1,'std::istreambuf_iterator::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#afb6691f43e173e47ffe52e245a360da1',1,'std::istreambuf_iterator::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'std::wbuffer_convert::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'std::wbuffer_convert::int_type']]], - ['integer_5fsequence_420',['integer_sequence',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04607.html',1,'std']]], - ['integerareainterptr_421',['IntegerAreaInterPtr',['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html',1,'cv::cudev']]], - ['integerareainterptrsz_422',['IntegerAreaInterPtrSz',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1cudev_1_1IntegerAreaInterPtrSz.html',1,'cv::cudev']]], - ['integral_423',['integral',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gadeaf38d7701d7ad371278d663c50c77d',1,'cv::integral(InputArray src, OutputArray sum, int sdepth=-1)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga8408f27268badd5478b9d3e39124d645',1,'cv::integral(InputArray src, OutputArray sum, OutputArray sqsum, int sdepth=-1, int sqdepth=-1)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga97b87bec26908237e8ba0f6e96d23e28',1,'cv::integral(InputArray src, OutputArray sum, OutputArray sqsum, OutputArray tilted, int sdepth=-1, int sqdepth=-1)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga07e5104eba4bf45212ac9dbc5bf72ba6',1,'cv::cuda::integral()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga9e3e85496c0c314bbb60fabf8eb09c0a',1,'cv::gapi::integral()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga78d53bcbe1710d0f7034e89fd0d43259',1,'cv::hal::integral()'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gadeaf38d7701d7ad371278d663c50c77d',1,'integral(InputArray src, OutputArray sum, int sdepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga8408f27268badd5478b9d3e39124d645',1,'integral(InputArray src, OutputArray sum, OutputArray sqsum, int sdepth=-1, int sqdepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga97b87bec26908237e8ba0f6e96d23e28',1,'integral(InputArray src, OutputArray sum, OutputArray sqsum, OutputArray tilted, int sdepth=-1, int sqdepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga78d53bcbe1710d0f7034e89fd0d43259',1,'integral(int depth, int sdepth, int sqdepth, const uchar *src, size_t srcstep, uchar *sum, size_t sumstep, uchar *sqsum, size_t sqsumstep, uchar *tilted, size_t tstep, int width, int height, int cn)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga9e3e85496c0c314bbb60fabf8eb09c0a',1,'integral(const GMat &src, int sdepth=-1, int sqdepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga07e5104eba4bf45212ac9dbc5bf72ba6',1,'integral(InputArray src, OutputArray sum, Stream &stream=Stream::Null())(Global Namespace)']]], - ['integral_2ehpp_424',['integral.hpp',['https://docs.opencv.org/4.2.0/d3/da8/integral_8hpp.html',1,'']]], - ['integral_5f_425',['integral_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23434664a9bd9d559afc5f51e1378d50',1,'cv::cudev::integral_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23434664a9bd9d559afc5f51e1378d50',1,'integral_()(Global Namespace)']]], - ['integral_5fconstant_426',['integral_constant',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'std']]], - ['integral_5fconstant_3c_20bool_2c_20_21ratio_5fequal_3c_20_5fr1_2c_20_5fr2_20_3e_3a_3avalue_20_3e_427',['integral_constant< bool, !ratio_equal< _R1, _R2 >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fbig_5fless_3c_20_5fleft_3a_3a_5f_5fhi_2c_20_5fleft_3a_3a_5f_5flo_2c_20_5fright_3a_3a_5f_5fhi_2c_20_5fright_3a_3a_5f_5flo_20_3e_3a_3avalue_20_3e_428',['integral_constant< bool, __big_less< _Left::__hi, _Left::__lo, _Right::__hi, _Right::__lo >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fhas_5fvirtual_5fdestructor_28_5ftp_29_3e_429',['integral_constant< bool, __has_virtual_destructor(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fabstract_28_5ftp_29_3e_430',['integral_constant< bool, __is_abstract(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fbase_5fof_28_5fbase_2c_20_5fderived_29_3e_431',['integral_constant< bool, __is_base_of(_Base, _Derived)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fclass_28_5ftp_29_3e_432',['integral_constant< bool, __is_class(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fempty_28_5ftp_29_3e_433',['integral_constant< bool, __is_empty(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fenum_28_5ftp_29_3e_434',['integral_constant< bool, __is_enum(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5ffinal_28_5ftp_29_3e_435',['integral_constant< bool, __is_final(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fliteral_5ftype_28_5ftp_29_3e_436',['integral_constant< bool, __is_literal_type(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fpod_28_5ftp_29_3e_437',['integral_constant< bool, __is_pod(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fpolymorphic_28_5ftp_29_3e_438',['integral_constant< bool, __is_polymorphic(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fstandard_5flayout_28_5ftp_29_3e_439',['integral_constant< bool, __is_standard_layout(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5ftrivial_28_5ftp_29_3e_440',['integral_constant< bool, __is_trivial(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5ftrivially_5fcopyable_28_5ftp_29_3e_441',['integral_constant< bool, __is_trivially_copyable(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5funion_28_5ftp_29_3e_442',['integral_constant< bool, __is_union(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20_5fr1_3a_3anum_3d_3d_5fr2_3a_3anum_20_26_26_5fr1_3a_3aden_3d_3d_5fr2_3a_3aden_20_3e_443',['integral_constant< bool, _R1::num==_R2::num &&_R1::den==_R2::den >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20noexcept_28_5ftp_28_29_29_3e_444',['integral_constant< bool, noexcept(_Tp())>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20noexcept_28_5ftp_28declval_3c_20_5fargs_20_3e_28_29_2e_2e_2e_29_29_3e_445',['integral_constant< bool, noexcept(_Tp(declval< _Args >()...))>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20noexcept_28declval_3c_20_5ftp_20_3e_28_29_3ddeclval_3c_20_5fup_20_3e_28_29_29_3e_446',['integral_constant< bool, noexcept(declval< _Tp >()=declval< _Up >())>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_20noexcept_28static_5fcast_3c_20_5ftp_20_3e_28declval_3c_20_5farg_20_3e_28_29_29_29_3e_447',['integral_constant< bool, noexcept(static_cast< _Tp >(declval< _Arg >()))>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_28_5f_5fhi1_3c_20_5f_5fhi2_7c_7c_28_5f_5fhi1_3d_3d_5f_5fhi2_20_26_26_5f_5flo1_3c_20_5f_5flo2_29_29_3e_448',['integral_constant< bool,(__hi1< __hi2||(__hi1==__hi2 &&__lo1< __lo2))>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20bool_2c_28extent_3c_20_5ftp_20_3e_3a_3avalue_20_3e_200_29_3e_449',['integral_constant< bool,(extent< _Tp >::value > 0)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20int_2c_200_20_3e_450',['integral_constant< int, 0 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20int_2c_20_5fnum_20_3e_451',['integral_constant< int, _Num >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20intmax_5ft_2c_20_5f_5fstatic_5fabs_3c_20_5fpn_20_3e_3a_3avalue_20_3e_452',['integral_constant< intmax_t, __static_abs< _Pn >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20intmax_5ft_2c_20_5f_5fstatic_5fabs_3c_20_5fqn_20_3e_3a_3avalue_20_3e_453',['integral_constant< intmax_t, __static_abs< _Qn >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20intmax_5ft_2c_20_5fpn_20_2a_5f_5fstatic_5fsign_3c_20_5fpn_20_3e_3a_3avalue_20_3e_454',['integral_constant< intmax_t, _Pn *__static_sign< _Pn >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20intmax_5ft_2c_28_5fpn_3c_200_29_20_3f_20_2d1_20_3a1_20_3e_455',['integral_constant< intmax_t,(_Pn< 0) ? -1 :1 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20size_5ft_2c_201_20_3e_456',['integral_constant< size_t, 1 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_200_20_3e_457',['integral_constant< std::size_t, 0 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_201_2brank_3c_20_5ftp_20_3e_3a_3avalue_20_3e_458',['integral_constant< std::size_t, 1+rank< _Tp >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_202_20_3e_459',['integral_constant< std::size_t, 2 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_20_5fnm_20_3e_460',['integral_constant< std::size_t, _Nm >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_20_5fuint_3d_3d0_20_3f_200_20_3aextent_3c_20_5ftp_2c_20_5fuint_20_2d_201_20_3e_3a_3avalue_20_3e_461',['integral_constant< std::size_t, _Uint==0 ? 0 :extent< _Tp, _Uint - 1 >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_20_5fuint_3d_3d0_20_3f_20_5fsize_20_3aextent_3c_20_5ftp_2c_20_5fuint_20_2d_201_20_3e_3a_3avalue_20_3e_462',['integral_constant< std::size_t, _Uint==0 ? _Size :extent< _Tp, _Uint - 1 >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_20alignof_28_5ftp_29_3e_463',['integral_constant< std::size_t, alignof(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_20sizeof_2e_2e_2e_28_5felements_29_3e_464',['integral_constant< std::size_t, sizeof...(_Elements)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20unsigned_2c_200_20_3e_465',['integral_constant< unsigned, 0 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20unsigned_2c_201_20_3e_466',['integral_constant< unsigned, 1 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integral_5fconstant_3c_20unsigned_2c_20_5fval_20_3e_467',['integral_constant< unsigned, _Val >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], - ['integralbody_468',['IntegralBody',['https://docs.opencv.org/4.2.0/d3/dde/structcv_1_1cudev_1_1IntegralBody.html',1,'cv::cudev']]], - ['integralhistogram_469',['integralHistogram',['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#aa8e94e11f6fe981c73a87a929f0e8824',1,'cv::CvHOGEvaluator']]], - ['integralimage_470',['integralImage',['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#a45be5fa84252fa4ef57a91bb84eae158',1,'cv::stereo::MVKernel']]], - ['integrated_471',['integrated',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#aace1742c04682d70838d30cdd6ef1927',1,'cv::cuda::DeviceInfo']]], - ['intel®_20mkl_20from_20eigen_472',['Using Intel® MKL from Eigen',['https://eigen.tuxfamily.org/dox/TopicUsingIntelMKL.html',1,'']]], - ['intel_20ipp_20asynchronous_20c_20c_20converters_473',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], - ['intel_20perceptual_20computing_20sdk_20compatible_20depth_20sensors_474',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], - ['intel_20va_20api_20opencl_20cl_20va_20interoperability_475',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], - ['intelperc_2emarkdown_476',['intelperc.markdown',['https://docs.opencv.org/4.2.0/d8/d80/intelperc_8markdown.html',1,'']]], - ['intelsubgroupssupport_477',['intelSubgroupsSupport',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a44ef751bc23e21d77a46f5985fca42dc',1,'cv::ocl::Device']]], - ['intensor_478',['inTensor',['https://docs.opencv.org/4.2.0/de/d5f/structcv_1_1GPlaidMLContext.html#a825fcbb4787de7de40e29a083e808c46',1,'cv::GPlaidMLContext']]], - ['inter_479',['INTER',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56a9dec0ceda288deaa617c4c65c88852ae',1,'cv::ml::SVM']]], - ['inter_5farea_480',['INTER_AREA',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121acf959dca2480cc694ca016b81b442ceb',1,'cv::INTER_AREA'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121acf959dca2480cc694ca016b81b442ceb',1,'INTER_AREA(Global Namespace)']]], - ['inter_5fbits_481',['INTER_BITS',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daea9ce4fddaf7714ea113a8a086d1d4b7f9',1,'cv::INTER_BITS'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daea9ce4fddaf7714ea113a8a086d1d4b7f9',1,'INTER_BITS(Global Namespace)']]], - ['inter_5fbits2_482',['INTER_BITS2',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daea5d3f110270a147224feaabac0c7a480b',1,'cv::INTER_BITS2'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daea5d3f110270a147224feaabac0c7a480b',1,'INTER_BITS2(Global Namespace)']]], - ['inter_5fcubic_483',['INTER_CUBIC',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121a55e404e7fa9684af79fe9827f36a5dc1',1,'cv::INTER_CUBIC'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121a55e404e7fa9684af79fe9827f36a5dc1',1,'INTER_CUBIC(Global Namespace)']]], - ['inter_5flanczos4_484',['INTER_LANCZOS4',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121ac6c578caa97f2d00f82bac879cf3c781',1,'cv::INTER_LANCZOS4'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121ac6c578caa97f2d00f82bac879cf3c781',1,'INTER_LANCZOS4(Global Namespace)']]], - ['inter_5flinear_485',['INTER_LINEAR',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121ac97d8e4880d8b5d509e96825c7522deb',1,'cv::INTER_LINEAR'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121ac97d8e4880d8b5d509e96825c7522deb',1,'INTER_LINEAR(Global Namespace)']]], - ['inter_5flinear_5fexact_486',['INTER_LINEAR_EXACT',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121ac00f4a8155563cdc23437fc0959da935',1,'cv::INTER_LINEAR_EXACT'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121ac00f4a8155563cdc23437fc0959da935',1,'INTER_LINEAR_EXACT(Global Namespace)']]], - ['inter_5fmax_487',['INTER_MAX',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121a49bb9f818707a31ae1f19158b60f7112',1,'cv::INTER_MAX'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121a49bb9f818707a31ae1f19158b60f7112',1,'INTER_MAX(Global Namespace)']]], - ['inter_5fnearest_488',['INTER_NEAREST',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121aa5521d8e080972c762467c45f3b70e6c',1,'cv::INTER_NEAREST'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121aa5521d8e080972c762467c45f3b70e6c',1,'INTER_NEAREST(Global Namespace)']]], - ['inter_5ftab_5fsize_489',['INTER_TAB_SIZE',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daea2dee31b51b2c400c35a31bf24f8cd809',1,'cv::INTER_TAB_SIZE'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daea2dee31b51b2c400c35a31bf24f8cd809',1,'INTER_TAB_SIZE(Global Namespace)']]], - ['inter_5ftab_5fsize2_490',['INTER_TAB_SIZE2',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daeabdbe1089b768d20af013c344bcac74cf',1,'cv::INTER_TAB_SIZE2'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daeabdbe1089b768d20af013c344bcac74cf',1,'INTER_TAB_SIZE2(Global Namespace)']]], - ['interactive_20camera_20calibration_20application_491',['Interactive camera calibration application',['https://docs.opencv.org/4.2.0/d7/d21/tutorial_interactive_calibration.html',1,'']]], - ['interactive_20foreground_20extraction_20using_20grabcut_20algorithm_492',['Interactive Foreground Extraction using GrabCut Algorithm',['https://docs.opencv.org/4.2.0/d8/d83/tutorial_py_grabcut.html',1,'']]], - ['interactive_20visual_20debugging_20of_20computer_20vision_20applications_493',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], - ['interactive_20visual_20debugging_20of_20computer_20vision_20programs_494',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], - ['interactive_5fcalibration_2emarkdown_495',['interactive_calibration.markdown',['https://docs.opencv.org/4.2.0/df/dc3/interactive__calibration_8markdown.html',1,'']]], - ['interactive_5fface_5fdetection_2emarkdown_496',['interactive_face_detection.markdown',['https://docs.opencv.org/4.2.0/d7/dda/interactive__face__detection_8markdown.html',1,'']]], - ['interarea_497',['interArea',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf033166d7ad42d8500efe06c26d98db3',1,'cv::cudev::interArea(const SrcPtr &src, Size areaSize)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d48e7e2175b23c83376184ddab4e1d',1,'cv::cudev::interArea(const SrcPtr &src, Size2f areaSize)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf033166d7ad42d8500efe06c26d98db3',1,'interArea(const SrcPtr &src, Size areaSize)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d48e7e2175b23c83376184ddab4e1d',1,'interArea(const SrcPtr &src, Size2f areaSize)(Global Namespace)']]], - ['intercubic_498',['interCubic',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba564442f7de5286d9627e2ba9dd80c7',1,'cv::cudev::interCubic()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba564442f7de5286d9627e2ba9dd80c7',1,'interCubic(const SrcPtr &src)(Global Namespace)']]], - ['interface_499',['Interface',['https://docs.opencv.org/4.2.0/d1/d1b/group__core__hal__interface.html',1,'Interface'],['https://docs.opencv.org/4.2.0/dd/d8b/group__imgproc__hal__interface.html',1,'Interface'],['https://docs.opencv.org/4.2.0/db/d47/group__features2d__hal__interface.html',1,'Interface']]], - ['interface_2eh_500',['interface.h',['https://docs.opencv.org/4.2.0/d2/d10/core_2include_2opencv2_2core_2hal_2interface_8h.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/d1e/imgproc_2include_2opencv2_2imgproc_2hal_2interface_8h.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0a/features2d_2include_2opencv2_2features2d_2hal_2interface_8h.html',1,'(Global Namespace)']]], - ['interfacing_20with_20raw_20buffers_3a_20the_20map_20class_501',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], - ['interlinear_502',['interLinear',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1dc51dc43ca68f41e9ee5529f7f55f8',1,'cv::cudev::interLinear()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1dc51dc43ca68f41e9ee5529f7f55f8',1,'interLinear()(Global Namespace)']]], - ['internal_503',['internal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'basic_ios< char, _Traits >::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'basic_iostream< char >::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'basic_istream< char >::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'basic_istream< char, _Traits >::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'basic_ostream< char >::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'basic_ostream< char, _Traits >::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_fstream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_ifstream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_ios::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_iostream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_istream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_istringstream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_ofstream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_ostream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_ostringstream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_stringstream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::ios_base::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a084be990a1caf21a3b1ce38fe61bad3f',1,'std::internal()']]], - ['internal_3a_3avideocaptureprivateaccessor_504',['VideoCapturePrivateAccessor',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#af1de3913d3e916106e718ebdf190f76e',1,'cv::VideoCapture']]], - ['internearest_505',['interNearest',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad405b90f08a3d8e8e08844f4255a40a7',1,'cv::cudev::interNearest()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad405b90f08a3d8e8e08844f4255a40a7',1,'interNearest(const SrcPtr &src)(Global Namespace)']]], - ['interoperability_506',['interoperability',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html',1,'DirectX interoperability'],['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'Intel VA-API/OpenCL (CL-VA) interoperability'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html',1,'OpenGL interoperability']]], - ['interp_5fepic_507',['INTERP_EPIC',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggac80d2a88890a3d8a1e655c91a24f3225a286254d8895e599c70603e226f2d3026',1,'cv::optflow::INTERP_EPIC'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggac80d2a88890a3d8a1e655c91a24f3225a286254d8895e599c70603e226f2d3026',1,'INTERP_EPIC(Global Namespace)']]], - ['interp_5ffactor_508',['interp_factor',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a2dc7abf68013ae8ee912a4cfdbe8b175',1,'cv::TrackerKCF::Params']]], - ['interp_5fgeo_509',['INTERP_GEO',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggac80d2a88890a3d8a1e655c91a24f3225adbe6372a8510a26dae909fd9e5acfacb',1,'cv::optflow::INTERP_GEO'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggac80d2a88890a3d8a1e655c91a24f3225adbe6372a8510a26dae909fd9e5acfacb',1,'INTERP_GEO(Global Namespace)']]], - ['interp_5fric_510',['INTERP_RIC',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggac80d2a88890a3d8a1e655c91a24f3225a7c079638b5150b20bdf5fb2a0acf5f15',1,'cv::optflow::INTERP_RIC'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggac80d2a88890a3d8a1e655c91a24f3225a7c079638b5150b20bdf5fb2a0acf5f15',1,'INTERP_RIC(Global Namespace)']]], - ['interplayer_511',['InterpLayer',['https://docs.opencv.org/4.2.0/de/d56/classcv_1_1dnn_1_1InterpLayer.html',1,'cv::dnn']]], - ['interpolate_512',['interpolate',['https://docs.opencv.org/4.2.0/d4/da8/classcv_1_1ximgproc_1_1SparseMatchInterpolator.html#a73934acbb2ef74b683c67cb765df1e0c',1,'cv::ximgproc::SparseMatchInterpolator']]], - ['interpolatecornerscharuco_513',['interpolateCornersCharuco',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gadcc5dc30c9ad33dcf839e84e8638dcd1',1,'cv::aruco::interpolateCornersCharuco()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gadcc5dc30c9ad33dcf839e84e8638dcd1',1,'interpolateCornersCharuco()(Global Namespace)']]], - ['interpolateframes_514',['interpolateFrames',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga03c554591bbb19e09624feb188525256',1,'cv::cuda::interpolateFrames()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga03c554591bbb19e09624feb188525256',1,'interpolateFrames(const GpuMat &frame0, const GpuMat &frame1, const GpuMat &fu, const GpuMat &fv, const GpuMat &bu, const GpuMat &bv, float pos, GpuMat &newFrame, GpuMat &buf, Stream &stream=Stream::Null())(Global Namespace)']]], - ['interpolation_2ehpp_515',['interpolation.hpp',['https://docs.opencv.org/4.2.0/d8/d8e/interpolation_8hpp.html',1,'']]], - ['interpolationflags_516',['interpolationFlags',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#abc0c8f54a1d223a1098206654813d973',1,'cv::Stitcher']]], - ['interpolationflags_517',['InterpolationFlags',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga5bb5a1fea74ea38e1a5445ca803ff121',1,'cv::InterpolationFlags'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga5bb5a1fea74ea38e1a5445ca803ff121',1,'InterpolationFlags(Global Namespace)']]], - ['interpolationmasks_518',['InterpolationMasks',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga628d8c499433359d67b1d830d46d8dae',1,'cv::InterpolationMasks'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga628d8c499433359d67b1d830d46d8dae',1,'InterpolationMasks(Global Namespace)']]], - ['interpolationtype_519',['InterpolationType',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gac80d2a88890a3d8a1e655c91a24f3225',1,'cv::optflow::InterpolationType'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gac80d2a88890a3d8a1e655c91a24f3225',1,'InterpolationType(Global Namespace)']]], - ['interprocess_520',['INTERPROCESS',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa912544338415c5f8c8e55e85a139bfbacf33d3d39ba006045591a2b297fb8c8b',1,'cv::cuda::Event']]], - ['intersect_5ffull_521',['INTERSECT_FULL',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaaf0eb9e10bd5adcbd446cd31fea2db68a56ab9c9ae145e505676ed8a6d90e032d',1,'cv::INTERSECT_FULL'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaaf0eb9e10bd5adcbd446cd31fea2db68a56ab9c9ae145e505676ed8a6d90e032d',1,'INTERSECT_FULL(Global Namespace)']]], - ['intersect_5fnone_522',['INTERSECT_NONE',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaaf0eb9e10bd5adcbd446cd31fea2db68a0499e05c23055c4b362b7c203ce06ea3',1,'cv::INTERSECT_NONE'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaaf0eb9e10bd5adcbd446cd31fea2db68a0499e05c23055c4b362b7c203ce06ea3',1,'INTERSECT_NONE(Global Namespace)']]], - ['intersect_5fpartial_523',['INTERSECT_PARTIAL',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaaf0eb9e10bd5adcbd446cd31fea2db68aba404626c7adb5e8b352a17be236a251',1,'cv::INTERSECT_PARTIAL'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaaf0eb9e10bd5adcbd446cd31fea2db68aba404626c7adb5e8b352a17be236a251',1,'INTERSECT_PARTIAL(Global Namespace)']]], - ['intersectconvexconvex_524',['intersectConvexConvex',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8e840f3f3695613d32c052bec89e782c',1,'cv::intersectConvexConvex()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8e840f3f3695613d32c052bec89e782c',1,'intersectConvexConvex()(Global Namespace)']]], - ['intersection_525',['intersection',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ad3d947d3e32b1521bb1ccd9eab4c46cb',1,'Eigen::AlignedBox::intersection()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a308d9231ca5a0ebffde94fb13fd9916a',1,'Eigen::Hyperplane::intersection()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a980dc8dc59ea6de2fb496055181a1d08',1,'Eigen::ParametrizedLine::intersection()']]], - ['intersection_5fover_5funion_526',['intersection_over_union',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#addf33c7ccf2d69158f9e863b99b99581',1,'cv::dnn_objdetect::InferBbox']]], - ['intersectionparameter_527',['intersectionParameter',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#af1d5100ee79a651e97ef716ad1af2ebe',1,'Eigen::ParametrizedLine']]], - ['intersectionpoint_528',['intersectionPoint',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a0ebbede4dd8f60da43128af9aabf0ead',1,'Eigen::ParametrizedLine']]], - ['intersects_529',['intersects',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a0bdea9a9410af7ad6f63ce71a2f59443',1,'Eigen::AlignedBox']]], - ['intervals_530',['intervals',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#acfc8ae5b0585354104c28233a1fad259',1,'std::piecewise_constant_distribution::intervals()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#aaf12335330484efaa86125c3ea3819c4',1,'std::piecewise_linear_distribution::intervals()']]], - ['intl_531',['intl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#aff5d9072376fa96a1b7f166151d32af5',1,'std::moneypunct']]], - ['into_20android_20development_532',['Introduction into Android Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'']]], - ['intr_533',['intr',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a1d6daf719153457cad9fe220f9120c92',1,'cv::dynafu::Params::intr'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a42e00e02b2cf33ffb8f68eefd5c2bf0a',1,'cv::kinfu::Params::intr']]], - ['intrin_2ehpp_534',['intrin.hpp',['https://docs.opencv.org/4.2.0/df/db4/intrin_8hpp.html',1,'']]], - ['intrin_5favx_2ehpp_535',['intrin_avx.hpp',['https://docs.opencv.org/4.2.0/d9/dd4/intrin__avx_8hpp.html',1,'']]], - ['intrin_5favx512_2ehpp_536',['intrin_avx512.hpp',['https://docs.opencv.org/4.2.0/d1/dc3/intrin__avx512_8hpp.html',1,'']]], - ['intrin_5fcpp_2ehpp_537',['intrin_cpp.hpp',['https://docs.opencv.org/4.2.0/d1/d94/intrin__cpp_8hpp.html',1,'']]], - ['intrin_5fforward_2ehpp_538',['intrin_forward.hpp',['https://docs.opencv.org/4.2.0/da/daa/intrin__forward_8hpp.html',1,'']]], - ['intrin_5fmsa_2ehpp_539',['intrin_msa.hpp',['https://docs.opencv.org/4.2.0/dd/d08/intrin__msa_8hpp.html',1,'']]], - ['intrin_5fneon_2ehpp_540',['intrin_neon.hpp',['https://docs.opencv.org/4.2.0/dd/d52/intrin__neon_8hpp.html',1,'']]], - ['intrin_5fsse_2ehpp_541',['intrin_sse.hpp',['https://docs.opencv.org/4.2.0/d2/d3c/intrin__sse_8hpp.html',1,'']]], - ['intrin_5fsse_5fem_2ehpp_542',['intrin_sse_em.hpp',['https://docs.opencv.org/4.2.0/d3/d95/intrin__sse__em_8hpp.html',1,'']]], - ['intrin_5fvsx_2ehpp_543',['intrin_vsx.hpp',['https://docs.opencv.org/4.2.0/d3/d96/intrin__vsx_8hpp.html',1,'']]], - ['intrin_5fwasm_2ehpp_544',['intrin_wasm.hpp',['https://docs.opencv.org/4.2.0/de/df3/intrin__wasm_8hpp.html',1,'']]], - ['intrinsic_20parameters_545',['Intrinsic Parameters',['../cameraconfig.html#intrinsic',1,'']]], - ['intrinsicparams_546',['intrinsicParams',['../structcam_1_1CameraConfig.html#aa8cf61c251e969a93facf420ba30e3e2',1,'cam::CameraConfig']]], - ['intrinsics_547',['Universal intrinsics',['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html',1,'']]], - ['intro_2emarkdown_548',['intro.markdown',['https://docs.opencv.org/4.2.0/d0/d2e/intro_8markdown.html',1,'']]], - ['introduction_549',['Introduction',['https://docs.opencv.org/4.2.0/d2/d94/bioinspired_retina.html',1,'Bioinspired Module Retina Introduction'],['https://docs.opencv.org/4.2.0/d2/dbc/cuda_intro.html',1,'CUDA Module Introduction'],['https://docs.opencv.org/4.2.0/d1/dfb/intro.html',1,'Introduction']]], - ['introduction_20into_20android_20development_550',['Introduction into Android Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'']]], - ['introduction_20to_20java_20development_551',['Introduction to Java Development',['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'']]], - ['introduction_20to_20opencv_552',['Introduction to OpenCV',['https://docs.opencv.org/4.2.0/df/d65/tutorial_table_of_content_introduction.html',1,'Introduction to OpenCV'],['https://docs.opencv.org/4.2.0/da/df6/tutorial_py_table_of_contents_setup.html',1,'Introduction to OpenCV']]], - ['introduction_20to_20opencv_20development_20with_20clojure_553',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], - ['introduction_20to_20opencv_20js_554',['Introduction to OpenCV.js',['https://docs.opencv.org/4.2.0/df/df7/tutorial_js_table_of_contents_setup.html',1,'']]], - ['introduction_20to_20opencv_20js_20and_20tutorials_555',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], - ['introduction_20to_20opencv_20python_20tutorials_556',['Introduction to OpenCV-Python Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'']]], - ['introduction_20to_20opencv_20tracker_557',['Introduction to OpenCV Tracker',['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'']]], - ['introduction_20to_20principal_20component_20analysis_20pca_558',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], - ['introduction_20to_20sift_20scale_20invariant_20feature_20transform_559',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], - ['introduction_20to_20support_20vector_20machines_560',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], - ['introduction_20to_20surf_20speeded_20up_20robust_20features_561',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], - ['introduction_5fto_5fpca_2emarkdown_562',['introduction_to_pca.markdown',['https://docs.opencv.org/4.2.0/de/d8a/introduction__to__pca_8markdown.html',1,'']]], - ['introduction_5fto_5fsvm_2emarkdown_563',['introduction_to_svm.markdown',['https://docs.opencv.org/4.2.0/d7/d6d/introduction__to__svm_8markdown.html',1,'']]], - ['inv_564',['inv',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ac4a16f4a77037c883dbbc2a4f617ee4f',1,'cv::Affine3::inv()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ac4a16f4a77037c883dbbc2a4f617ee4f',1,'Affine3< float >::inv()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a039eb3c6740a850696a12519a4b8bfc6',1,'cv::Mat::inv()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6b6f538841a37416d5461f919f5e7bf6',1,'cv::MatExpr::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'cv::Matx::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< _Tp, cn, 1 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, 1, 3 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, 2, 2 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, 2, 3 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, 3, 3 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, 3, 4 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, 4, 4 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, cn, 1 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< float, 2, 3 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< float, 3, 3 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< float, cn, 1 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< float_type, 4, 4 >::inv()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#abb77173e3e661fc3f161f79e5559c5d7',1,'cv::UMat::inv()']]], - ['inval_565',['inVal',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#aa69e3939982302a2bcaf3e8b020b6d4d',1,'cv::GCPUContext::inVal()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a3f4f9a4dbebc501d9bf7c0c23f2c92bf',1,'cv::GOCLContext::inVal()']]], - ['invalid_5fargument_566',['invalid_argument',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02799.html',1,'std']]], - ['invalid_5fcamera_5fconfig_567',['invalid_camera_config',['../classcam_1_1invalid__camera__config.html',1,'cam::invalid_camera_config'],['../classcam_1_1invalid__camera__config.html#ae208195e58e6517792218d583241322d',1,'cam::invalid_camera_config::invalid_camera_config()'],['../classcam_1_1invalid__camera__config.html#a664e017c22cbba50993bbacbb0ff97b6',1,'cam::invalid_camera_config::invalid_camera_config(const std::string &msg)']]], - ['invalid_5fiterator_568',['invalid_iterator',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6ccc9788413fd58de998fe92743cb4aa.html#a6ccc9788413fd58de998fe92743cb4aa',1,'nlohmann::basic_json']]], - ['invalidation_20guarantees_569',['Invalidation Guarantees',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01538.html',1,'']]], - ['invalidinput_570',['InvalidInput',['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea580b2a3cafe585691e789f768fb729bf',1,'Eigen::InvalidInput'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea580b2a3cafe585691e789f768fb729bf',1,'InvalidInput(Global Namespace)']]], - ['invariant_20feature_20transform_571',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], - ['inverse_572',['Inverse',['https://eigen.tuxfamily.org/dox/classEigen_1_1Inverse.html',1,'Eigen']]], - ['inverse_573',['inverse',['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#af01cf54d9e86fe12b41a4b7f70d06c2b',1,'Eigen::AngleAxis::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a31c45402e74774d9cd13af0e57a6b72f',1,'Eigen::ColPivHouseholderQR::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a31c45402e74774d9cd13af0e57a6b72f',1,'ColPivHouseholderQR< MatrixType >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a352ce66397af06da214ddde343cec6f5',1,'Eigen::FullPivHouseholderQR::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#ae6f4bb55f859f6353f99cf15ecff4b25',1,'Eigen::FullPivLU::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#a02014cb7359500d5bd51b6f8ee4d34fc',1,'Eigen::HouseholderSequence::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7712eb69e8ea3c8f7b8da1c44dbdeebf',1,'Eigen::MatrixBase::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7712eb69e8ea3c8f7b8da1c44dbdeebf',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7712eb69e8ea3c8f7b8da1c44dbdeebf',1,'MatrixBase< Solve< Decomposition, RhsType > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#aef983470f92aba829e861e32e68681b5',1,'Eigen::PartialPivLU::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adb9af427f317202366c2832876064eb3',1,'Eigen::PermutationBase::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adb9af427f317202366c2832876064eb3',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adb9af427f317202366c2832876064eb3',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adb9af427f317202366c2832876064eb3',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adb9af427f317202366c2832876064eb3',1,'PermutationBase< PermutationWrapper< _IndicesType > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ab12ee41b3b06adc3062217a795a6a9f5',1,'Eigen::QuaternionBase::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ab12ee41b3b06adc3062217a795a6a9f5',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ab12ee41b3b06adc3062217a795a6a9f5',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ab12ee41b3b06adc3062217a795a6a9f5',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a5c01f57e3a382c7f677ac9ff3b95aea6',1,'Eigen::Rotation2D::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'Eigen::RotationBase::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'RotationBase< AngleAxis< _Scalar >, 3 >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'RotationBase< Derived, 3 >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'RotationBase< Rotation2D< _Scalar >, 2 >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ab8dbcd157bf194efca1a5413c0945211',1,'Eigen::Transform::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#aa72ee6bccce7f26cbef57550308e6aaf',1,'Eigen::Translation::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a60dba22bebe9e2c97cfbc76f85eb1b78',1,'Eigen::UniformScaling::inverse()'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae9de9064c3b832ee804c0e0957e80334',1,'Eigen::inverse()']]], - ['inverse_20square_20root_20calculation_574',['Inverse square root calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'']]], - ['inversearmkinematics_575',['InverseArmKinematics',['../classkinematics_1_1InverseArmKinematics.html',1,'kinematics::InverseArmKinematics< D, N >'],['../classkinematics_1_1InverseArmKinematics.html#aad65afdcfb61a30f8fa7ee851bfc6d10',1,'kinematics::InverseArmKinematics::InverseArmKinematics()']]], - ['inversearmkinematics_3c_202_2c_20n_20_3e_576',['InverseArmKinematics< 2, N >',['../classkinematics_1_1InverseArmKinematics.html',1,'kinematics']]], - ['inversed_577',['inversed',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#afa6f45d243a85f1ee318b95c9c65b4f4',1,'cv::ml::DTrees::Split']]], - ['inversemap_578',['inverseMap',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html#ac1720d6a6875d6c8ef132941dd3dd29a',1,'cv::reg::Map::inverseMap()'],['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#a7912260577af849d886b252850cbcec4',1,'cv::reg::MapAffine::inverseMap()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#ac7b99925455e3f507110aeb51ec8e69d',1,'cv::reg::MapProjec::inverseMap()'],['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html#aadddeaed88de4e9b82d268df5acf0dcf',1,'cv::reg::MapShift::inverseMap()']]], - ['inversewarp_579',['inverseWarp',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html#a8c68ada5f02eff2a48c8b5654ce61ca4',1,'cv::reg::Map::inverseWarp()'],['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#aef18374208fbb6b010b8450036de434f',1,'cv::reg::MapAffine::inverseWarp()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#abb00b486f8d6ead26f153f9ff1802c4f',1,'cv::reg::MapProjec::inverseWarp()'],['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html#ab1c8fe2f73ee20358a5f270537840109',1,'cv::reg::MapShift::inverseWarp()']]], - ['invert_580',['invert',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a33bc65dedc2b1a9b626b277b49493bc0',1,'cv::MatOp::invert()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad278044679d4ecf20f7622cc151aaaa2',1,'cv::invert()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad278044679d4ecf20f7622cc151aaaa2',1,'invert()(Global Namespace)']]], - ['invertaffinetransform_581',['invertAffineTransform',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga57d3505a878a7e1a636645727ca08f51',1,'cv::invertAffineTransform()'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga57d3505a878a7e1a636645727ca08f51',1,'invertAffineTransform()(Global Namespace)']]], - ['invoke_582',['invoke',['https://docs.opencv.org/4.2.0/d5/dd6/structcv_1_1detail_1_1TransHelper_3_01K_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01Out_01_4.html#ad6af4ecc182a5d4beac040ff4c373290',1,'cv::detail::TransHelper< K, std::tuple< Ins... >, Out >']]], - ['invoke_2eh_583',['invoke.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00383.html',1,'']]], - ['invsqrt32f_584',['invSqrt32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae41866c26362d0ee7d48198f7b1215de',1,'cv::hal::invSqrt32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae41866c26362d0ee7d48198f7b1215de',1,'invSqrt32f()(Global Namespace)']]], - ['invsqrt64f_585',['invSqrt64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8eecdda77ea46172be12b2a580eb7a14',1,'cv::hal::invSqrt64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8eecdda77ea46172be12b2a580eb7a14',1,'invSqrt64f(const double *src, double *dst, int len)(Global Namespace)']]], - ['io_2ehpp_586',['io.hpp',['https://docs.opencv.org/4.2.0/d2/dc6/io_8hpp.html',1,'']]], - ['io_5ferrc_587',['io_errc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5a20cae60a4377da46121402c57322a2',1,'std']]], - ['ioformat_588',['IOFormat',['https://eigen.tuxfamily.org/dox/structEigen_1_1IOFormat.html',1,'Eigen::IOFormat'],['https://eigen.tuxfamily.org/dox/structEigen_1_1IOFormat.html#acdcc91702d45c714b11ba42db5beddb5',1,'Eigen::IOFormat::IOFormat()']]], - ['iomanip_589',['iomanip',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00077.html',1,'']]], - ['ios_590',['Installation in iOS',['https://docs.opencv.org/4.2.0/d5/da3/tutorial_ios_install.html',1,'']]], - ['ios_591',['ios',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00080.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gac1665745293037f1d1be9b144f27bc9d',1,'std::ios'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gac1665745293037f1d1be9b144f27bc9d',1,'ios(Global Namespace)']]], - ['ios_592',['OpenCV iOS',['https://docs.opencv.org/4.2.0/d3/dc9/tutorial_table_of_content_ios.html',1,'']]], - ['ios_20glue_593',['iOS glue',['https://docs.opencv.org/4.2.0/d2/d92/group__imgcodecs__ios.html',1,'']]], - ['ios_20glue_20for_20video_20i_20o_594',['iOS glue for video I/O',['https://docs.opencv.org/4.2.0/d5/d26/group__videoio__ios.html',1,'']]], - ['ios_20hello_595',['OpenCV iOS Hello',['https://docs.opencv.org/4.2.0/d7/d88/tutorial_hello.html',1,'']]], - ['ios_20image_20processing_596',['OpenCV iOS - Image Processing',['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'']]], - ['ios_20video_20processing_597',['OpenCV iOS - Video Processing',['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'']]], - ['ios_2eh_598',['ios.h',['https://docs.opencv.org/4.2.0/df/dd5/ios_8h.html',1,'']]], - ['ios_5fbase_599',['ios_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html',1,'std']]], - ['ios_5fbase_2eh_600',['ios_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00386.html',1,'']]], - ['ios_5finstall_2emarkdown_601',['ios_install.markdown',['https://docs.opencv.org/4.2.0/d2/dc6/ios__install_8markdown.html',1,'']]], - ['iosfwd_602',['iosfwd',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00083.html',1,'']]], - ['iostate_603',['iostate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'basic_ios< char, _Traits >::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'basic_iostream< char >::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'basic_istream< char >::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'basic_istream< char, _Traits >::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'basic_ostream< char >::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'basic_ostream< char, _Traits >::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_fstream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_ifstream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_ios::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_iostream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_istream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_istringstream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_ofstream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_ostream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_ostringstream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_stringstream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::ios_base::iostate']]], - ['iostream_604',['iostream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00086.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga5eca2cc3d038099cf2465636dfb2ace6',1,'std::iostream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga5eca2cc3d038099cf2465636dfb2ace6',1,'iostream(Global Namespace)']]], - ['iota_605',['iota',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#gae2511dfcafd338758fa6670e3055bec1',1,'std::iota()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#gae2511dfcafd338758fa6670e3055bec1',1,'iota()(Global Namespace)']]], - ['ioutlierrejector_606',['IOutlierRejector',['https://docs.opencv.org/4.2.0/d9/dbb/classcv_1_1videostab_1_1IOutlierRejector.html',1,'cv::videostab']]], - ['iplmagno_607',['IplMagno',['https://docs.opencv.org/4.2.0/d2/df5/structcv_1_1bioinspired_1_1RetinaParameters.html#a1875391e7a0ef9fb82cc88b4b700f3de',1,'cv::bioinspired::RetinaParameters']]], - ['iplmagnoparameters_608',['IplMagnoParameters',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters'],['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a0d15280a2a8850b966b2059254062281',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters::IplMagnoParameters()']]], - ['ipp_20asynchronous_20c_20c_20converters_609',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], - ['iqa_20api_610',['Image Quality Analysis (IQA) API',['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'']]], - ['ir_5faffine_611',['IR_affine',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1datasets_1_1IR__affine.html',1,'cv::datasets']]], - ['ir_5faffine_2ehpp_612',['ir_affine.hpp',['https://docs.opencv.org/4.2.0/d8/d32/ir__affine_8hpp.html',1,'']]], - ['ir_5faffineobj_613',['IR_affineObj',['https://docs.opencv.org/4.2.0/d9/dff/structcv_1_1datasets_1_1IR__affineObj.html',1,'cv::datasets']]], - ['ir_5frobot_614',['IR_robot',['https://docs.opencv.org/4.2.0/d7/d5f/classcv_1_1datasets_1_1IR__robot.html',1,'cv::datasets']]], - ['ir_5frobot_2ehpp_615',['ir_robot.hpp',['https://docs.opencv.org/4.2.0/d4/d5f/ir__robot_8hpp.html',1,'']]], - ['ir_5frobotobj_616',['IR_robotObj',['https://docs.opencv.org/4.2.0/d8/d7d/structcv_1_1datasets_1_1IR__robotObj.html',1,'cv::datasets']]], - ['is_617',['IS',['https://docs.opencv.org/4.2.0/d0/dc4/classcv_1_1GFluidKernel.html#a9b302cf0f61f16dda9d192b9c0c12627',1,'cv::GFluidKernel']]], - ['is_618',['is',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af6d5ac31c2da7cd350672e88a4b6c89e',1,'__ctype_abstract_base< wchar_t >::is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a98b93b10d5d0700394d0dbd2dd1a3742',1,'__ctype_abstract_base< wchar_t >::is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af6d5ac31c2da7cd350672e88a4b6c89e',1,'std::__ctype_abstract_base::is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a98b93b10d5d0700394d0dbd2dd1a3742',1,'std::__ctype_abstract_base::is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af6d5ac31c2da7cd350672e88a4b6c89e',1,'std::ctype::is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a98b93b10d5d0700394d0dbd2dd1a3742',1,'std::ctype::is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a966c54a29d5fb4424486f74ceacaed4a',1,'std::ctype< char >::is(mask __m, char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a3f98c7b3851c877d90a1c55102506b30',1,'std::ctype< char >::is(const char *__lo, const char *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af6d5ac31c2da7cd350672e88a4b6c89e',1,'std::ctype< wchar_t >::is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a98b93b10d5d0700394d0dbd2dd1a3742',1,'std::ctype< wchar_t >::is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af6d5ac31c2da7cd350672e88a4b6c89e',1,'std::ctype_byname::is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a98b93b10d5d0700394d0dbd2dd1a3742',1,'std::ctype_byname::is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a966c54a29d5fb4424486f74ceacaed4a',1,'std::ctype_byname< char >::is(mask __m, char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a3f98c7b3851c877d90a1c55102506b30',1,'std::ctype_byname< char >::is(const char *__lo, const char *__hi, mask *__vec) const']]], - ['is_5fabstract_619',['is_abstract',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03507.html',1,'std']]], - ['is_5falways_5fequal_620',['is_always_equal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#afae6957b1a6d68084b2b6114dff01ae8',1,'__alloc_traits< _Tp_alloc_type >::is_always_equal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#afae6957b1a6d68084b2b6114dff01ae8',1,'__gnu_cxx::__alloc_traits::is_always_equal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#afae6957b1a6d68084b2b6114dff01ae8',1,'allocator_traits< _Tp_alloc_type >::is_always_equal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#afae6957b1a6d68084b2b6114dff01ae8',1,'std::allocator_traits::is_always_equal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a90f7e4bb63b02a787cac38f4ab470488',1,'std::allocator_traits< allocator< _Tp > >::is_always_equal']]], - ['is_5farithmetic_621',['is_arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03415.html',1,'std']]], - ['is_5farray_622',['is_array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03219.html',1,'std::is_array< class >'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab5b70d60a636b9c5e10f6c8caac60b9e.html#ab5b70d60a636b9c5e10f6c8caac60b9e',1,'nlohmann::basic_json::is_array()']]], - ['is_5fassignable_623',['is_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03695.html',1,'std']]], - ['is_5fassignable_3c_20_5ftp_20_26_2c_20_5ftp_20_26_26_20_3e_624',['is_assignable< _Tp &, _Tp && >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03695.html',1,'']]], - ['is_5fassignable_3c_20_5ftp_20_26_2c_20const_20_5ftp_20_26_20_3e_625',['is_assignable< _Tp &, const _Tp & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03695.html',1,'']]], - ['is_5fbase_5fof_626',['is_base_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03903.html',1,'std']]], - ['is_5fbinary_627',['is_binary',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9576224f7b3ff812a308e7c1e784ea80.html#a9576224f7b3ff812a308e7c1e784ea80',1,'nlohmann::basic_json']]], - ['is_5fbind_5fexpression_628',['is_bind_expression',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02099.html',1,'std']]], - ['is_5fbind_5fexpression_3c_20_5fbind_3c_20_5fsignature_20_3e_20_3e_629',['is_bind_expression< _Bind< _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02155.html',1,'std']]], - ['is_5fbind_5fexpression_3c_20_5fbind_5fresult_3c_20_5fresult_2c_20_5fsignature_20_3e_20_3e_630',['is_bind_expression< _Bind_result< _Result, _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02171.html',1,'std']]], - ['is_5fbind_5fexpression_3c_20const_20_5fbind_3c_20_5fsignature_20_3e_20_3e_631',['is_bind_expression< const _Bind< _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02159.html',1,'std']]], - ['is_5fbind_5fexpression_3c_20const_20_5fbind_5fresult_3c_20_5fresult_2c_20_5fsignature_20_3e_20_3e_632',['is_bind_expression< const _Bind_result< _Result, _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02175.html',1,'std']]], - ['is_5fbind_5fexpression_3c_20const_20volatile_20_5fbind_3c_20_5fsignature_20_3e_20_3e_633',['is_bind_expression< const volatile _Bind< _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02167.html',1,'std']]], - ['is_5fbind_5fexpression_3c_20const_20volatile_20_5fbind_5fresult_3c_20_5fresult_2c_20_5fsignature_20_3e_20_3e_634',['is_bind_expression< const volatile _Bind_result< _Result, _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02183.html',1,'std']]], - ['is_5fbind_5fexpression_3c_20volatile_20_5fbind_3c_20_5fsignature_20_3e_20_3e_635',['is_bind_expression< volatile _Bind< _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02163.html',1,'std']]], - ['is_5fbind_5fexpression_3c_20volatile_20_5fbind_5fresult_3c_20_5fresult_2c_20_5fsignature_20_3e_20_3e_636',['is_bind_expression< volatile _Bind_result< _Result, _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02179.html',1,'std']]], - ['is_5fboolean_637',['is_boolean',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a911b11e855e685fa59ea1d111490b36b.html#a911b11e855e685fa59ea1d111490b36b',1,'nlohmann::basic_json']]], - ['is_5fbounded_638',['is_bounded',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a73d31de0788cee8f432f0a9075e97a76',1,'std::__numeric_limits_base::is_bounded'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a73d31de0788cee8f432f0a9075e97a76',1,'std::numeric_limits::is_bounded']]], - ['is_5fbsds_639',['IS_bsds',['https://docs.opencv.org/4.2.0/dd/d0e/classcv_1_1datasets_1_1IS__bsds.html',1,'cv::datasets']]], - ['is_5fbsds_2ehpp_640',['is_bsds.hpp',['https://docs.opencv.org/4.2.0/df/d12/is__bsds_8hpp.html',1,'']]], - ['is_5fbsdsobj_641',['IS_bsdsObj',['https://docs.opencv.org/4.2.0/db/d07/structcv_1_1datasets_1_1IS__bsdsObj.html',1,'cv::datasets']]], - ['is_5fclass_642',['is_class',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03295.html',1,'std']]], - ['is_5fcompile_5farg_643',['is_compile_arg',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#af956decf22b4f8834bc2f5c998676428',1,'cv::detail']]], - ['is_5fcompound_644',['is_compound',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03435.html',1,'std']]], - ['is_5fconst_645',['is_const',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03459.html',1,'std::is_const< class >'],['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#af42665cc886e8b5d39830e0edb40d8c1ac77245fd19edebbf4c1fc7dad7ecc091',1,'cv::cudev::TypeTraits::is_const']]], - ['is_5fconstructible_646',['is_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03587.html',1,'std']]], - ['is_5fconstructible_3c_20_5ftp_2c_20_5ftp_20_26_26_20_3e_647',['is_constructible< _Tp, _Tp && >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03587.html',1,'']]], - ['is_5fconstructible_3c_20_5ftp_2c_20const_20_5ftp_20_26_20_3e_648',['is_constructible< _Tp, const _Tp & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03587.html',1,'']]], - ['is_5fconvertible_649',['is_convertible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03915.html',1,'std']]], - ['is_5fcopy_5fassignable_650',['is_copy_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03711.html',1,'std']]], - ['is_5fcopy_5fconstructible_651',['is_copy_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03607.html',1,'std']]], - ['is_5fdefault_5fconstructible_652',['is_default_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03591.html',1,'std']]], - ['is_5fdestructible_653',['is_destructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03555.html',1,'std']]], - ['is_5fdiscarded_654',['is_discarded',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aecaaa0613d3f3a5b49b34b02afc5f85d.html#aecaaa0613d3f3a5b49b34b02afc5f85d',1,'nlohmann::basic_json']]], - ['is_5fempty_655',['is_empty',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03495.html',1,'std']]], - ['is_5femptyset_656',['is_emptyset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#a65ed1ee8eb1992fd9d4a25898d2a0db2',1,'std::tr2::bool_set']]], - ['is_5fenum_657',['is_enum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03287.html',1,'std']]], - ['is_5ferror_5fcode_5fenum_658',['is_error_code_enum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02827.html',1,'std']]], - ['is_5ferror_5fcode_5fenum_3c_20future_5ferrc_20_3e_659',['is_error_code_enum< future_errc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02231.html',1,'std']]], - ['is_5ferror_5fcondition_5fenum_660',['is_error_condition_enum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02831.html',1,'std']]], - ['is_5fexact_661',['is_exact',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a81640a55cbeb9fccfbedd74ce954a439',1,'std::__numeric_limits_base::is_exact'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a81640a55cbeb9fccfbedd74ce954a439',1,'std::numeric_limits::is_exact']]], - ['is_5ffinal_662',['is_final',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03503.html',1,'std']]], - ['is_5ffloat_663',['is_float',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a0c1d429642e695e89ecca1dea947cba9a1ee61db9efb22adcecbc9aa939729799',1,'cv::cudev::TypeTraits']]], - ['is_5ffloating_5fpoint_664',['is_floating_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03215.html',1,'std']]], - ['is_5ffloating_5fpoint_3c_20_5frep_20_3e_665',['is_floating_point< _Rep >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03215.html',1,'']]], - ['is_5ffunction_666',['is_function',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03259.html',1,'std']]], - ['is_5ffundamental_667',['is_fundamental',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03419.html',1,'std']]], - ['is_5fgarg_668',['is_garg',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a114e5a006e6617de4f375c9efc02d74f',1,'cv::detail']]], - ['is_5fgmat_5ftype_669',['is_gmat_type',['https://docs.opencv.org/4.2.0/d9/dc3/structcv_1_1detail_1_1is__gmat__type.html',1,'cv::detail']]], - ['is_5fgrow_5fneeded_670',['is_grow_needed',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#ad50aebe50070ae305b6c17a522bf6d0b',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::is_grow_needed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a5ae2c89a2bd75110d67fef5f361fed8c',1,'__gnu_pbds::sample_resize_trigger::is_grow_needed()']]], - ['is_5fheap_671',['is_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga33b76a74543508747285e182dce4e7ba',1,'std::is_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga37f2af54af0ffe3b364736c8bd84314e',1,'std::is_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga33b76a74543508747285e182dce4e7ba',1,'is_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga37f2af54af0ffe3b364736c8bd84314e',1,'is_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['is_5fheap_5funtil_672',['is_heap_until',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gad3cf2f5b736b585f20dfd29ba24293e1',1,'std::is_heap_until(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gac559e3fbb78b63111a38545f7f530f23',1,'std::is_heap_until(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gad3cf2f5b736b585f20dfd29ba24293e1',1,'is_heap_until(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gac559e3fbb78b63111a38545f7f530f23',1,'is_heap_until(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['is_5fiec559_673',['is_iec559',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a76fdc688c82a37689f4920a9776fc593',1,'std::__numeric_limits_base::is_iec559'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a76fdc688c82a37689f4920a9776fc593',1,'std::numeric_limits::is_iec559']]], - ['is_5findeterminate_674',['is_indeterminate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#a584b2bb82827cf99abbe1e59f2bb683c',1,'std::tr2::bool_set']]], - ['is_5finteger_675',['is_integer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a1080a407fe101570ab1a619fe8071396',1,'std::__numeric_limits_base::is_integer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a1080a407fe101570ab1a619fe8071396',1,'std::numeric_limits::is_integer']]], - ['is_5fintegral_676',['is_integral',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03195.html',1,'std::is_integral< class >'],['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a3a4f8b3e2a620fa6b5d0094508dbbc2da3b4d37f77948252f4b1cc2b193b53fb7',1,'cv::cudev::TypeTraits::is_integral']]], - ['is_5fliteral_5ftype_677',['is_literal_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03491.html',1,'std']]], - ['is_5flvalue_5freference_678',['is_lvalue_reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03243.html',1,'std']]], - ['is_5fmember_5ffunction_5fpointer_679',['is_member_function_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03283.html',1,'std']]], - ['is_5fmember_5fobject_5fpointer_680',['is_member_object_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03271.html',1,'std']]], - ['is_5fmember_5fpointer_681',['is_member_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03427.html',1,'std']]], - ['is_5fmeta_5fdescr_682',['is_meta_descr',['https://docs.opencv.org/4.2.0/d3/d8d/structcv_1_1detail_1_1is__meta__descr.html',1,'cv::detail']]], - ['is_5fmeta_5fdescr_3c_20garraydesc_20_3e_683',['is_meta_descr< GArrayDesc >',['https://docs.opencv.org/4.2.0/dc/de2/structcv_1_1detail_1_1is__meta__descr_3_01GArrayDesc_01_4.html',1,'cv::detail']]], - ['is_5fmeta_5fdescr_3c_20gmatdesc_20_3e_684',['is_meta_descr< GMatDesc >',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1detail_1_1is__meta__descr_3_01GMatDesc_01_4.html',1,'cv::detail']]], - ['is_5fmeta_5fdescr_3c_20gscalardesc_20_3e_685',['is_meta_descr< GScalarDesc >',['https://docs.opencv.org/4.2.0/db/dbe/structcv_1_1detail_1_1is__meta__descr_3_01GScalarDesc_01_4.html',1,'cv::detail']]], - ['is_5fmodulo_686',['is_modulo',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a05f7c8b3b2be44d621e3fd1f0e738461',1,'std::__numeric_limits_base::is_modulo'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a05f7c8b3b2be44d621e3fd1f0e738461',1,'std::numeric_limits::is_modulo']]], - ['is_5fmove_5fassignable_687',['is_move_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03727.html',1,'std']]], - ['is_5fmove_5fconstructible_688',['is_move_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03623.html',1,'std']]], - ['is_5fnongapi_5ftype_689',['is_nongapi_type',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#ad57d9a185891336ec22959ec778d1e67',1,'cv::detail']]], - ['is_5fnothrow_5fassignable_690',['is_nothrow_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03735.html',1,'std']]], - ['is_5fnothrow_5fassignable_3c_20_5ftp_20_26_2c_20_5ftp_20_26_26_20_3e_691',['is_nothrow_assignable< _Tp &, _Tp && >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03735.html',1,'']]], - ['is_5fnothrow_5fassignable_3c_20_5ftp_20_26_2c_20const_20_5ftp_20_26_20_3e_692',['is_nothrow_assignable< _Tp &, const _Tp & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03735.html',1,'']]], - ['is_5fnothrow_5fconstructible_693',['is_nothrow_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03659.html',1,'std']]], - ['is_5fnothrow_5fconstructible_3c_20_5ftp_2c_20_5ftp_20_26_26_20_3e_694',['is_nothrow_constructible< _Tp, _Tp && >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03659.html',1,'']]], - ['is_5fnothrow_5fconstructible_3c_20_5ftp_2c_20const_20_5ftp_20_26_20_3e_695',['is_nothrow_constructible< _Tp, const _Tp & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03659.html',1,'']]], - ['is_5fnothrow_5fcopy_5fassignable_696',['is_nothrow_copy_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03751.html',1,'std']]], - ['is_5fnothrow_5fcopy_5fconstructible_697',['is_nothrow_copy_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03675.html',1,'std']]], - ['is_5fnothrow_5fdefault_5fconstructible_698',['is_nothrow_default_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03643.html',1,'std']]], - ['is_5fnothrow_5fdestructible_699',['is_nothrow_destructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03583.html',1,'std']]], - ['is_5fnothrow_5fmove_5fassignable_700',['is_nothrow_move_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03767.html',1,'std']]], - ['is_5fnothrow_5fmove_5fconstructible_701',['is_nothrow_move_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03691.html',1,'std']]], - ['is_5fnothrow_5fswappable_702',['is_nothrow_swappable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04483.html',1,'std']]], - ['is_5fnothrow_5fswappable_5fv_703',['is_nothrow_swappable_v',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa2b86e9636133cced6ebccab3e95fb0b',1,'std']]], - ['is_5fnothrow_5fswappable_5fwith_704',['is_nothrow_swappable_with',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04515.html',1,'std']]], - ['is_5fnothrow_5fswappable_5fwith_5fv_705',['is_nothrow_swappable_with_v',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a35b3f518dd97d4fa57eeb0ae8fd7622f',1,'std']]], - ['is_5fnull_706',['is_null',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aedc7afad96292b5ab61a2e0ad3067f5f.html#aedc7afad96292b5ab61a2e0ad3067f5f',1,'nlohmann::basic_json']]], - ['is_5fnull_5fpointer_707',['is_null_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03403.html',1,'std']]], - ['is_5fnumber_708',['is_number',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_abd47ac8eba63833152795280f75b5851.html#abd47ac8eba63833152795280f75b5851',1,'nlohmann::basic_json']]], - ['is_5fnumber_5ffloat_709',['is_number_float',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a116cdb9300b56519fc9cf756609296cb.html#a116cdb9300b56519fc9cf756609296cb',1,'nlohmann::basic_json']]], - ['is_5fnumber_5finteger_710',['is_number_integer',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac4b4acf2c0ad075c0dc125a65c102362.html#ac4b4acf2c0ad075c0dc125a65c102362',1,'nlohmann::basic_json']]], - ['is_5fnumber_5funsigned_711',['is_number_unsigned',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5493f2ed1e07b0ece428bd5a47e2fb95.html#a5493f2ed1e07b0ece428bd5a47e2fb95',1,'nlohmann::basic_json']]], - ['is_5fobj_5fwithout_5fholes_712',['is_obj_without_holes',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#a964d1931beeb3ff3a2792d1e86d39175',1,'cv::cuda::FGDParams']]], - ['is_5fobject_713',['is_object',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03423.html',1,'std::is_object< class >'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a57e8411a770a6263d6d8f2116c37f3aa.html#a57e8411a770a6263d6d8f2116c37f3aa',1,'nlohmann::basic_json::is_object()']]], - ['is_5fopen_714',['is_open',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a56ddf5ebdff55e7aaf51077a51c4d42f',1,'__gnu_cxx::enc_filebuf::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a56ddf5ebdff55e7aaf51077a51c4d42f',1,'__gnu_cxx::stdio_filebuf::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a56ddf5ebdff55e7aaf51077a51c4d42f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a56ddf5ebdff55e7aaf51077a51c4d42f',1,'basic_filebuf< char_type, traits_type >::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a56ddf5ebdff55e7aaf51077a51c4d42f',1,'std::basic_filebuf::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02079.html#a715c50358129e80ce7a37ee157c141a7',1,'std::basic_fstream::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02071.html#afcbe0c0931007c7359e16543abe1fe87',1,'std::basic_ifstream::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02075.html#aef0ea13a6d1c1bc6ee4f1ebc71e18414',1,'std::basic_ofstream::is_open()']]], - ['is_5fpartitioned_715',['is_partitioned',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaba1a020bbd42810ce065fa9e239652d6',1,'std::is_partitioned()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaba1a020bbd42810ce065fa9e239652d6',1,'is_partitioned()(Global Namespace)']]], - ['is_5fpermutation_716',['is_permutation',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gadc446c7587539490a05da590d6c51a58',1,'std::is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga714d45aee3d18a5e281557b48d092b8e',1,'std::is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _BinaryPredicate __pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga1ce2f1378028db705f805394b6e150a7',1,'std::is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad8c1b9d831347f0795b364b59b5c9daf',1,'std::is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2, _BinaryPredicate __pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gadc446c7587539490a05da590d6c51a58',1,'is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga714d45aee3d18a5e281557b48d092b8e',1,'is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _BinaryPredicate __pred)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga1ce2f1378028db705f805394b6e150a7',1,'is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad8c1b9d831347f0795b364b59b5c9daf',1,'is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2, _BinaryPredicate __pred)(Global Namespace)']]], - ['is_5fplaceholder_717',['is_placeholder',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02103.html',1,'std']]], - ['is_5fplaceholder_3c_20_5fplaceholder_3c_20_5fnum_20_3e_20_3e_718',['is_placeholder< _Placeholder< _Num > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02111.html',1,'std']]], - ['is_5fpod_719',['is_pod',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03487.html',1,'std']]], - ['is_5fpointer_720',['is_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03239.html',1,'std::is_pointer< class >'],['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a8503f494dae8899dc034e2fc2e50f407aa0e8fdac033ac8c4a1d91cae4a30d081',1,'cv::cudev::TypeTraits::is_pointer']]], - ['is_5fpolymorphic_721',['is_polymorphic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03499.html',1,'std']]], - ['is_5fprimitive_722',['is_primitive',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a548d2d4013da24e7d7510d90febc80c4.html#a548d2d4013da24e7d7510d90febc80c4',1,'nlohmann::basic_json']]], - ['is_5freference_723',['is_reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03411.html',1,'std::is_reference< class >'],['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#acd65e5e1819f7b0001c1f577ab064a02a0e4da83f213adb8d0fbbe733fbbc4d87',1,'cv::cudev::TypeTraits::is_reference']]], - ['is_5fresize_5fneeded_724',['is_resize_needed',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a7c5123f36dfca1b53699730fd2d184e8',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::is_resize_needed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a58af3aa0d57d0192ac037607f26f37e5',1,'__gnu_pbds::sample_resize_policy::is_resize_needed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a7f3e6d0aaabbde56e883bf742f301a46',1,'__gnu_pbds::sample_resize_trigger::is_resize_needed()']]], - ['is_5frvalue_5freference_725',['is_rvalue_reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03251.html',1,'std']]], - ['is_5fsame_726',['is_same',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03895.html',1,'std::is_same< class, class >'],['https://docs.opencv.org/4.2.0/d1/d34/structcv_1_1util_1_1detail_1_1type__list__index__helper.html#ae1453099bf8c995a01be9aa1ae707866',1,'cv::util::detail::type_list_index_helper::is_same']]], - ['is_5fscalar_727',['is_scalar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03431.html',1,'std::is_scalar< class >'],['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a4b6baa5b7a3c3ba8c776a8ca3eb70b13a312173208643daf68de8f6909ca9fefb',1,'cv::cudev::TypeTraits::is_scalar']]], - ['is_5fsetpoint_5fvalid_728',['is_setpoint_valid',['../classcontrol_1_1PlanarArmController.html#a5c18177ea8456ab6d5f696ef0225305d',1,'control::PlanarArmController']]], - ['is_5fsigned_729',['is_signed',['https://docs.opencv.org/4.2.0/da/d81/structcv_1_1cudev_1_1numeric__limits_3_01bool_01_4.html#aa198d700d80212f36881ac57bd18d0b3',1,'cv::cudev::numeric_limits< bool >::is_signed'],['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html#abd973ff57ee6cf9ce436ca4c24fb1912',1,'cv::cudev::numeric_limits< double >::is_signed'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html#aaea688b0456889aada71b29a157e631e',1,'cv::cudev::numeric_limits< float >::is_signed'],['https://docs.opencv.org/4.2.0/da/d4e/structcv_1_1cudev_1_1numeric__limits_3_01schar_01_4.html#ae7adb637089ac7ab75e8970f01873b1a',1,'cv::cudev::numeric_limits< schar >::is_signed'],['https://docs.opencv.org/4.2.0/d1/d8b/structcv_1_1cudev_1_1numeric__limits_3_01short_01_4.html#a33a346ba8cdd6be6a9defa77be7ed54b',1,'cv::cudev::numeric_limits< short >::is_signed'],['https://docs.opencv.org/4.2.0/d3/dc7/structcv_1_1cudev_1_1numeric__limits_3_01uchar_01_4.html#a3c94d331147034dd35a918973f9b8920',1,'cv::cudev::numeric_limits< uchar >::is_signed'],['https://docs.opencv.org/4.2.0/dd/d89/structcv_1_1cudev_1_1numeric__limits_3_01uint_01_4.html#a9c1561950370fa6d05d0e2b2f738a003',1,'cv::cudev::numeric_limits< uint >::is_signed'],['https://docs.opencv.org/4.2.0/df/d47/structcv_1_1cudev_1_1numeric__limits_3_01ushort_01_4.html#ada06dd9385aae7a229b5a3252be1ca6e',1,'cv::cudev::numeric_limits< ushort >::is_signed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ac9fad027d1b91ec445d58e5036e8ea0b',1,'std::__numeric_limits_base::is_signed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ac9fad027d1b91ec445d58e5036e8ea0b',1,'std::numeric_limits::is_signed']]], - ['is_5fsigned_5fint_730',['is_signed_int',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a13588798235cb4a6cd1e3e2e1832ed6aa5f6a9241455b0b3feddcc9f30105567f',1,'cv::cudev::TypeTraits']]], - ['is_5fsingleton_731',['is_singleton',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#a967a4154ed069a5c9dfd55f53f60de2b',1,'std::tr2::bool_set']]], - ['is_5fsorted_732',['is_sorted',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a5337f3b4d2394123033a6c6279abbb',1,'std::is_sorted(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaba6fffa1d87bd34155dcd980bbe02a53',1,'std::is_sorted(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a5337f3b4d2394123033a6c6279abbb',1,'is_sorted(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaba6fffa1d87bd34155dcd980bbe02a53',1,'is_sorted(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], - ['is_5fsorted_5funtil_733',['is_sorted_until',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga76cfb20887dfce8ce554053b6b6935c9',1,'std::is_sorted_until(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga07069e2148fa7ce5fc6df47a43fd8240',1,'std::is_sorted_until(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga76cfb20887dfce8ce554053b6b6935c9',1,'is_sorted_until(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga07069e2148fa7ce5fc6df47a43fd8240',1,'is_sorted_until(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], - ['is_5fspecialized_734',['is_specialized',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ac5f6c4f5343b7060e87d95c2ddb406eb',1,'std::__numeric_limits_base::is_specialized'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ac5f6c4f5343b7060e87d95c2ddb406eb',1,'std::numeric_limits::is_specialized']]], - ['is_5fstandard_5flayout_735',['is_standard_layout',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03483.html',1,'std']]], - ['is_5fstring_736',['is_string',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab303d17366c26fca12242c7f8def1bb7.html#ab303d17366c26fca12242c7f8def1bb7',1,'nlohmann::basic_json']]], - ['is_5fstructured_737',['is_structured',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4e05a7d5deec758f1d830741b68b4249.html#a4e05a7d5deec758f1d830741b68b4249',1,'nlohmann::basic_json']]], - ['is_5fswappable_738',['is_swappable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04479.html',1,'std']]], - ['is_5fswappable_5fv_739',['is_swappable_v',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9f35f5ddaff13c2c1d262efe1fbdd510',1,'std']]], - ['is_5fswappable_5fwith_740',['is_swappable_with',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04511.html',1,'std']]], - ['is_5fswappable_5fwith_5fv_741',['is_swappable_with_v',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5e63c1d59eac70153a804ab6bacc3d1f',1,'std']]], - ['is_5fthread_5fsafe_5f_742',['is_thread_safe_',['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#ae3b24af101c26164a5a253b7d1c37dda',1,'cv::detail::FeaturesMatcher']]], - ['is_5ftrivial_743',['is_trivial',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03475.html',1,'std']]], - ['is_5ftrivially_5fassignable_744',['is_trivially_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03827.html',1,'std']]], - ['is_5ftrivially_5fconstructible_745',['is_trivially_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03771.html',1,'std']]], - ['is_5ftrivially_5fdefault_5fconstructible_746',['is_trivially_default_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03775.html',1,'std']]], - ['is_5ftrivially_5fdestructible_747',['is_trivially_destructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03863.html',1,'std']]], - ['is_5ftuple_748',['is_tuple',['https://docs.opencv.org/4.2.0/dd/d08/structcv_1_1cudev_1_1TupleTraits.html#af056351d95043ecb7978a89683f37acda119ce0267b22821a9816b64e305aa324',1,'cv::cudev::TupleTraits::is_tuple'],['https://docs.opencv.org/4.2.0/d2/dae/structcv_1_1cudev_1_1TupleTraits_3_01tuple_3_01P0_00_01P1_00_01P2_00_01P3_00_01P4_00_01P5_00_01P41642a2d25b95a5ddb87ca2004b28336.html#a101fdabed1a4325f149f1dd0fb4ef409a1179218adcd5afa3010f2a53e8c080fa',1,'cv::cudev::TupleTraits< tuple< P0, P1, P2, P3, P4, P5, P6, P7, P8, P9 > >::is_tuple']]], - ['is_5funion_749',['is_union',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03291.html',1,'std']]], - ['is_5funsigned_5fint_750',['is_unsigned_int',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#ad6ae9669fd006f425815f5340c1f542fa03b990e48682d85d943ebfa60d3e5830',1,'cv::cudev::TypeTraits']]], - ['is_5fvec_751',['is_vec',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a5439cb3d9a68aaec7292a0d99dd22a87a4658592db01008e688603ac4f31442fe',1,'cv::cudev::TypeTraits']]], - ['is_5fvoid_752',['is_void',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03127.html',1,'std']]], - ['is_5fvolatile_753',['is_volatile',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03467.html',1,'std::is_volatile< class >'],['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#adf45e5dd0585f4fa9d2c811f63e122e7a3acffbbfc9cce12550844c3d8420699b',1,'cv::cudev::TypeTraits::is_volatile']]], - ['is_5fweizmann_754',['IS_weizmann',['https://docs.opencv.org/4.2.0/d9/dbe/classcv_1_1datasets_1_1IS__weizmann.html',1,'cv::datasets']]], - ['is_5fweizmann_2ehpp_755',['is_weizmann.hpp',['https://docs.opencv.org/4.2.0/d3/db5/is__weizmann_8hpp.html',1,'']]], - ['is_5fweizmannobj_756',['IS_weizmannObj',['https://docs.opencv.org/4.2.0/d8/d65/structcv_1_1datasets_1_1IS__weizmannObj.html',1,'cv::datasets']]], - ['isaligned_757',['isAligned',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gadbc1b082037ac3725f3b12fe6c541c61',1,'cv::isAligned(const T &data)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga0097dcc52f97e95d694a887f523b7d81',1,'cv::isAligned(const void *p1)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae3ed31d1c50282265abcb27c669d51bb',1,'cv::isAligned(const void *p1, const void *p2)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga4a80b9260cb1a5b3b07217cf42d0474d',1,'cv::isAligned(const void *p1, const void *p2, const void *p3)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga74dc86ab666c4a81841b6bed3f68742e',1,'cv::isAligned(const void *p1, const void *p2, const void *p3, const void *p4)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gadbc1b082037ac3725f3b12fe6c541c61',1,'isAligned(const T &data)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga0097dcc52f97e95d694a887f523b7d81',1,'isAligned(const void *p1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae3ed31d1c50282265abcb27c669d51bb',1,'isAligned(const void *p1, const void *p2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga4a80b9260cb1a5b3b07217cf42d0474d',1,'isAligned(const void *p1, const void *p2, const void *p3)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga74dc86ab666c4a81841b6bed3f68742e',1,'isAligned(const void *p1, const void *p2, const void *p3, const void *p4)(Global Namespace)']]], - ['isalnum_758',['isalnum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5ed2f4fbd4906acc523688bd4413c0a7',1,'std']]], - ['isalpha_759',['isalpha',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad9b540b5d331edca5e6b8c9ac0ae2b41',1,'std']]], - ['isamd_760',['isAMD',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a493978e6044f4eeb81a0c187c7441269',1,'cv::ocl::Device']]], - ['isanyclosed_761',['isAnyClosed',['../classrobot_1_1types_1_1LimitSwitchData.html#a7a12a083516bc8cc9821a922dc3934c3',1,'robot::types::LimitSwitchData']]], - ['isanyopen_762',['isAnyOpen',['../classrobot_1_1types_1_1LimitSwitchData.html#ab321d51e5d4db4ab8b69e0a74198fd00',1,'robot::types::LimitSwitchData']]], - ['isapprox_763',['isApprox',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ad785aecce6792bd88c3a4de35d782f18',1,'Eigen::AlignedBox::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#ac0f2fe0856dedd6f46891a70ec9f402d',1,'Eigen::AngleAxis::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae8443357b808cd393be1b51974213f9c',1,'Eigen::DenseBase::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae8443357b808cd393be1b51974213f9c',1,'DenseBase< ArrayWrapper< ExpressionType > >::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae8443357b808cd393be1b51974213f9c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae8443357b808cd393be1b51974213f9c',1,'DenseBase< Solve< Decomposition, RhsType > >::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ad5f22e31d700adf1144eecda45075494',1,'Eigen::Hyperplane::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#adb58b8eb1d9a81a4b02b7bbbebd84413',1,'Eigen::ParametrizedLine::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a64bc41c96a9e99567e0f8409f8f0f680',1,'Eigen::QuaternionBase::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a64bc41c96a9e99567e0f8409f8f0f680',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a64bc41c96a9e99567e0f8409f8f0f680',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a64bc41c96a9e99567e0f8409f8f0f680',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a9c6889cb1a96ab8549effc94bfa06cd6',1,'Eigen::Rotation2D::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#abd1696d9bb754e5c8734e691e03243f9',1,'Eigen::Transform::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a3dfc243795eef9c94bf65f0837f563c8',1,'Eigen::Translation::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a7f736fdbe43f7bce3d277312efdc315e',1,'Eigen::UniformScaling::isApprox()']]], - ['isapproxtoconstant_764',['isApproxToConstant',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9b150d48bc5e4366887ccb466e40c6b',1,'Eigen::DenseBase::isApproxToConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9b150d48bc5e4366887ccb466e40c6b',1,'DenseBase< ArrayWrapper< ExpressionType > >::isApproxToConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9b150d48bc5e4366887ccb466e40c6b',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isApproxToConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9b150d48bc5e4366887ccb466e40c6b',1,'DenseBase< Solve< Decomposition, RhsType > >::isApproxToConstant()']]], - ['isbinaryfunction_765',['IsBinaryFunction',['https://docs.opencv.org/4.2.0/d1/de5/structcv_1_1cudev_1_1IsBinaryFunction.html',1,'cv::cudev']]], - ['isblank_766',['isblank',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a40d8b84052bcaa94888bad01890ce72c',1,'std']]], - ['iscanceled_767',['isCanceled',['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1gapi_1_1wip_1_1GAsyncContext.html#a92dc8ba8ab9e78d1cb0bd648a6452fe4',1,'cv::gapi::wip::GAsyncContext']]], - ['isclassifier_768',['isClassifier',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#a1121a835feedefdcdb8624966567aec6',1,'cv::ml::StatModel']]], - ['isclosed_769',['isClosed',['../classrobot_1_1types_1_1LimitSwitchData.html#ae50bfaab487c0f45a2b9d9d85f3d6429',1,'robot::types::LimitSwitchData']]], - ['iscntrl_770',['iscntrl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#adcec25eda0a6f12b4c9d7453f30a5a69',1,'std']]], - ['iscollection_771',['isCollection',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ab007ad87e7cc2fdd6e6e5db86dbd805c',1,'cv::FileNode']]], - ['iscompatible_772',['isCompatible',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a33fee042c8998a4af0ec5d0f81d7a3b3',1,'cv::cuda::DeviceInfo']]], - ['iscompressed_773',['isCompressed',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'Eigen::SparseCompressedBase::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< Derived >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< Transpose< MatrixType > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#aafab4afa7ab2ff89eff049d4c71e2ce4',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'Eigen::SparseMatrix::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseMatrix< Scalar >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseMatrix< Scalar, ColMajor, int >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::isCompressed()']]], - ['isconstant_774',['isConstant',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1ca84e4179b3e5081ed11d89bbd9e74f',1,'Eigen::DenseBase::isConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1ca84e4179b3e5081ed11d89bbd9e74f',1,'DenseBase< ArrayWrapper< ExpressionType > >::isConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1ca84e4179b3e5081ed11d89bbd9e74f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1ca84e4179b3e5081ed11d89bbd9e74f',1,'DenseBase< Solve< Decomposition, RhsType > >::isConstant()']]], - ['iscontinuous_775',['isContinuous',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#af38d2ea2a7ec65f622d267eed4863578',1,'cv::_InputArray::isContinuous()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a400fc4c7880bf132f2ffea03892486b0',1,'cv::cuda::GpuMat::isContinuous()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ad091db7d7ddc0e484d2556cf36b8e0af',1,'cv::cuda::HostMem::isContinuous()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa90cea495029c7d1ee0a41361ccecdf3',1,'cv::Mat::isContinuous()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#af9f1dc7d12bb762061089e1c3bd77875',1,'cv::UMat::isContinuous()']]], - ['iscontourconvex_776',['isContourConvex',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8abf8010377b58cbc16db6734d92941b',1,'cv::isContourConvex()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8abf8010377b58cbc16db6734d92941b',1,'isContourConvex()(Global Namespace)']]], - ['iscounting_777',['isCounting',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#ab001a82eb5b4c3af9145733dc6cad213',1,'INCVMemAllocator::isCounting()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#ad68c654e99d7cee2ee5f8748872d0991',1,'NCVMemNativeAllocator::isCounting()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#a48e22bb3fca10c405624df97c955e9c3',1,'NCVMemStackAllocator::isCounting()']]], - ['isctype_778',['isctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ad819d5f658133c4dd71c1fa5a7cb9031',1,'regex_traits< _CharType >::isctype()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ad819d5f658133c4dd71c1fa5a7cb9031',1,'std::regex_traits::isctype()']]], - ['isdiagonal_779',['isDiagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a97027ea54c8cd1ddb1c578fee5cedc67',1,'Eigen::MatrixBase::isDiagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a97027ea54c8cd1ddb1c578fee5cedc67',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isDiagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a97027ea54c8cd1ddb1c578fee5cedc67',1,'MatrixBase< Solve< Decomposition, RhsType > >::isDiagonal()']]], - ['isdigit_780',['isdigit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a385dc92279bd0d29a34d143be653d0e1',1,'std']]], - ['isdirectory_781',['isDirectory',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#a26219f574f38cb8f632621a6042c8a9c',1,'cv::utils::fs']]], - ['isdone_782',['isDone',['../classcommands_1_1DriveToWaypointCommand.html#a238d0bd5012fbc251d421d670b796283',1,'commands::DriveToWaypointCommand']]], - ['isempty_783',['isEmpty',['https://docs.opencv.org/4.2.0/df/dba/classcv_1_1dpm_1_1DPMDetector.html#a68ccc5923115564aa0bb6f43d6d11ebd',1,'cv::dpm::DPMDetector::isEmpty()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a2d994551368f0d06876a31dccb26de59',1,'Eigen::AlignedBox::isEmpty()']]], - ['isemptycollection_784',['isEmptyCollection',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a60ff5026e4027e7dfab7021d14784a0e',1,'cv::FileNode']]], - ['isemptyframeoffset_785',['isEmptyFrameOffset',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a822f556e73f50162e295b2ba57b0f4ad',1,'cv::AVIWriteContainer']]], - ['isemptyframesize_786',['isEmptyFrameSize',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#accb77bc2f0a14820da7ec9e2c63b098d',1,'cv::AVIWriteContainer']]], - ['isextensionsupported_787',['isExtensionSupported',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a741dffeacbcc911d273c8f248e4fb323',1,'cv::ocl::Device']]], - ['isfinite_788',['isfinite',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#aba24ec81dec745a00b7f33adead89811',1,'Eigen']]], - ['isflow_789',['isFlow',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#abde856ed7e0ba8d3d0fdaf3c5b64dc28',1,'cv::FileNode']]], - ['isformatsupported_790',['isFormatSupported',['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#ae864e2b519e2533923aafbba2bdd3f7d',1,'cv::ocl::Image2D']]], - ['isfree_791',['isfree',['https://docs.opencv.org/4.2.0/d4/dbc/structcv_1_1Subdiv2D_1_1QuadEdge.html#a76603c01b665d05416c67dffcfb9058f',1,'cv::Subdiv2D::QuadEdge::isfree()'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a162921ccd975e6588ead65defbd71c38',1,'cv::Subdiv2D::Vertex::isfree()']]], - ['isfresh_792',['isFresh',['../classrobot_1_1types_1_1DataPoint.html#a170f57107f592540c5fc6a548a0621e9',1,'robot::types::DataPoint']]], - ['isgpumat_793',['isGpuMat',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a541a32b10224d53e8407ba0bb2c8f076',1,'cv::_InputArray']]], - ['isgpumatvector_794',['isGpuMatVector',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a2f3eb944ab23455d4a0c5db922a3705b',1,'cv::_InputArray']]], - ['isgraph_795',['isgraph',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a03fa822c443ea8d03c55c7a4affc204f',1,'std']]], - ['isidentity_796',['isIdentity',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a4ccbd8dfa06e9d47b9bf84711f8b9d40',1,'Eigen::MatrixBase::isIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a4ccbd8dfa06e9d47b9bf84711f8b9d40',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a4ccbd8dfa06e9d47b9bf84711f8b9d40',1,'MatrixBase< Solve< Decomposition, RhsType > >::isIdentity()']]], - ['isidmapped_797',['isIDMapped',['../classAR_1_1MarkerSet.html#a79ad36749ca8409352d3be0d9574212d',1,'AR::MarkerSet']]], - ['isinf_798',['isInf',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4baf2433a45e75cd5adcd27f944265c1',1,'cv::softdouble::isInf()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga361d1cbf6593c26ea61285d094b5aa54',1,'cv::softfloat::isInf()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga361d1cbf6593c26ea61285d094b5aa54',1,'isInf()(Global Namespace)']]], - ['isinf_799',['isinf',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a1f1103712e337c4c96a05f949637a4c8',1,'Eigen']]], - ['isinit_800',['isInit',['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a4f32981bce5a9c55d46d048089ff65f6',1,'cv::Tracker']]], - ['isinitialized_801',['isInitialized',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a2690ff629378e78f6d2d1d1e5b6e317b',1,'cv::ccalib::CustomPattern::isInitialized()'],['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#aa537f9cda2a22dcb69e7ea89ba6edabc',1,'INCVMemAllocator::isInitialized()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#a88bcdf07f57526a3f1f00c6350276129',1,'NCVMemNativeAllocator::isInitialized()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#ac099da57816008471815f17c64beda0e',1,'NCVMemStackAllocator::isInitialized()']]], - ['isinjective_802',['isInjective',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a0031998053c9c7345c9458f7443aa263',1,'Eigen::ColPivHouseholderQR::isInjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a0031998053c9c7345c9458f7443aa263',1,'ColPivHouseholderQR< MatrixType >::isInjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a2740067b81ec3e0ad20a2bea9a5a475f',1,'Eigen::CompleteOrthogonalDecomposition::isInjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a6776788011026b0f63192485a59deaed',1,'Eigen::FullPivHouseholderQR::isInjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#ab13992c852aa593461d9b81790b56667',1,'Eigen::FullPivLU::isInjective()']]], - ['isint_803',['isInt',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a38b79c9ea8309f61627a27c3818ec894',1,'cv::dnn::DictValue::isInt()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aeac30395ae3473911171a2091c6ab74c',1,'cv::FileNode::isInt()']]], - ['isintegral_804',['isIntegral',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#ad4380bce54af16ade9ceb3950653b728',1,'cv::CvHaarEvaluator::isIntegral'],['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#ab2bfe0def9426436d79631529878f230',1,'cv::CvHaarFeatureParams::isIntegral'],['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html#a9cc81d32c81332139c15403ce726aeda',1,'cv::TrackerFeatureHAAR::Params::isIntegral']]], - ['isintel_805',['isIntel',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a38df2acd5461680d87a812d77ca02d5e',1,'cv::ocl::Device']]], - ['isinverted_806',['isInverted',['../structrobot_1_1encparams__t.html#a54ef590fd3dca30c9fed8d72738c4787',1,'robot::encparams_t']]], - ['isinvertible_807',['isInvertible',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a945720f8d683f8ebe97fa807edd3142a',1,'Eigen::ColPivHouseholderQR::isInvertible()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a945720f8d683f8ebe97fa807edd3142a',1,'ColPivHouseholderQR< MatrixType >::isInvertible()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a7c4f24f868295349a3bb99e5f217b069',1,'Eigen::CompleteOrthogonalDecomposition::isInvertible()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aeb1d779ec22ec68a5a28d4235db02ec1',1,'Eigen::FullPivHouseholderQR::isInvertible()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#afdf2579c93473650f2ef2a47a376c4a0',1,'Eigen::FullPivLU::isInvertible()']]], - ['isknown_808',['isKnown',['https://docs.opencv.org/4.2.0/d4/dd9/structcvv_1_1impl_1_1CallMetaData.html#a0df9fb9a44398306c05e1b009caacb4d',1,'cvv::impl::CallMetaData']]], - ['island_809',['island',['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#a91a81b54c71d0c42bf9372a9e292ebe3',1,'cv::gapi']]], - ['isleftnodeleaf_810',['isLeftNodeLeaf',['https://docs.opencv.org/4.2.0/df/d88/structHaarFeatureDescriptor32.html#abca5878272c73ca3ca080d099f2356b4',1,'HaarFeatureDescriptor32']]], - ['islower_811',['islower',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a21d54d07c27156b1bb5c49155cbd58d1',1,'std']]], - ['islowertriangular_812',['isLowerTriangular',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1e96c42d79a56f0a6ade30ce031e17eb',1,'Eigen::MatrixBase::isLowerTriangular()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1e96c42d79a56f0a6ade30ce031e17eb',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isLowerTriangular()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1e96c42d79a56f0a6ade30ce031e17eb',1,'MatrixBase< Solve< Decomposition, RhsType > >::isLowerTriangular()']]], - ['ismap_813',['isMap',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#afe948d153d1962ff4c9ad02b1295d832',1,'cv::FileNode::isMap() const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a0be930eaeab2e06cbf2502913d0ec870',1,'cv::FileNode::isMap(int flags)']]], - ['ismaskedout_814',['isMaskedOut',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#acf9d628dd4c52e6ff00eb92801fd0921',1,'cv::DescriptorMatcher']]], - ['ismasksupported_815',['isMaskSupported',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#a15bc508b250c96ecd49e153dfcbf019a',1,'cv::BFMatcher::isMaskSupported()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a3cc074710ccb466a662815969e14cf5e',1,'cv::DescriptorMatcher::isMaskSupported()'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a356ddc4994cfc7543859fa96b5b229c1',1,'cv::cuda::DescriptorMatcher::isMaskSupported()'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a614976020b9ef7ecfc419b23e122206d',1,'cv::FlannBasedMatcher::isMaskSupported()']]], - ['ismat_816',['isMat',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7157baa2f1e8801053a5ff2a56006448',1,'cv::_InputArray']]], - ['ismatvector_817',['isMatVector',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#ad8b51d941c9a4286f2fc362d6e951bc2',1,'cv::_InputArray']]], - ['ismatx_818',['isMatx',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#af221eb464622ee46d0d3a8c63358023b',1,'cv::_InputArray']]], - ['ismemallocated_819',['isMemAllocated',['https://docs.opencv.org/4.2.0/d7/d3a/classNCVMatrixAlloc.html#a5cd5b740956cf2c5b5ccc5e1abc477fc',1,'NCVMatrixAlloc::isMemAllocated()'],['https://docs.opencv.org/4.2.0/d8/da0/classNCVVectorAlloc.html#aa805756efcfe48896890f1c9ef153a92',1,'NCVVectorAlloc::isMemAllocated()']]], - ['ismemreused_820',['isMemReused',['https://docs.opencv.org/4.2.0/df/d82/classNCVMatrixReuse.html#a6b7494fd1717f56be16c4e25362c7d06',1,'NCVMatrixReuse::isMemReused()'],['https://docs.opencv.org/4.2.0/da/d61/classNCVVectorReuse.html#a6fa6e78e73c0dc61241757d3d96627eb',1,'NCVVectorReuse::isMemReused()']]], - ['ismuchsmallerthan_821',['isMuchSmallerThan',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3c4db0c6dd974fa88bbb58b2cf3d5664',1,'Eigen::DenseBase::isMuchSmallerThan(const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adfca6ff4e473f68fbbeabbd03b7504a9',1,'Eigen::DenseBase::isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3c4db0c6dd974fa88bbb58b2cf3d5664',1,'DenseBase< ArrayWrapper< ExpressionType > >::isMuchSmallerThan(const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adfca6ff4e473f68fbbeabbd03b7504a9',1,'DenseBase< ArrayWrapper< ExpressionType > >::isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3c4db0c6dd974fa88bbb58b2cf3d5664',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isMuchSmallerThan(const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adfca6ff4e473f68fbbeabbd03b7504a9',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3c4db0c6dd974fa88bbb58b2cf3d5664',1,'DenseBase< Solve< Decomposition, RhsType > >::isMuchSmallerThan(const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adfca6ff4e473f68fbbeabbd03b7504a9',1,'DenseBase< Solve< Decomposition, RhsType > >::isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const']]], - ['isnamed_822',['isNamed',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa129964f34bc9c288bdd6195c71f0836',1,'cv::FileNode']]], - ['isnan_823',['isNaN',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae19d8a1b2dd1e0806c7d2de07f82f829',1,'cv::softdouble::isNaN()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5001848e8ce56d145ad32301981a12a9',1,'cv::softfloat::isNaN()']]], - ['isnan_824',['isnan',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a99adfc5178f3fd5488304284388b2a10',1,'Eigen']]], - ['isnan_825',['isNaN',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5001848e8ce56d145ad32301981a12a9',1,]]], - ['isnan_826',['isNan',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac1c740657f322dea194e709414743e81',1,'cv::viz::isNan(float x)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac89eaf4fd08fad1f55e315c0e67acf65',1,'cv::viz::isNan(double x)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga0d937e5774fedecb73ea47652f339a02',1,'cv::viz::isNan(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga1a10dc77396c81df53ad300ea4a426c8',1,'cv::viz::isNan(const Point3_< _Tp > &p)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac1c740657f322dea194e709414743e81',1,'isNan(float x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac89eaf4fd08fad1f55e315c0e67acf65',1,'isNan(double x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga0d937e5774fedecb73ea47652f339a02',1,'isNan(const Vec< _Tp, cn > &v)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga1a10dc77396c81df53ad300ea4a426c8',1,'isNan(const Point3_< _Tp > &p)(Global Namespace)']]], - ['isnd_827',['isND',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a2597ddde56d22b00bc0174978309849b',1,'cv::GMatDesc']]], - ['isnegative_828',['isNegative',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#aabd3e7aebe844034caca4c62dbe9c1eb',1,'Eigen::LDLT']]], - ['isnone_829',['isNone',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a6039b64bf7c1719056f3ef2626d882e1',1,'cv::FileNode']]], - ['isnull_830',['isNull',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a37b401dd265c942c9ef2db1e2b1e56e5',1,'Eigen::AlignedBox']]], - ['isnvidia_831',['isNVidia',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a233ee631d4694cf140100e57a415177b',1,'cv::ocl::Device']]], - ['isoldformatcascade_832',['isOldFormatCascade',['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#aee2b340811fff9aff1770feec7ef7d55',1,'cv::BaseCascadeClassifier::isOldFormatCascade()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a556bdd8738ba96aac07628ec38ff46da',1,'cv::CascadeClassifier::isOldFormatCascade()']]], - ['isometry_833',['Isometry',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaee59a86102f150923b0cac6d4ff05107a84413028615d2d718bafd2dfb93dafef',1,'Eigen::Isometry'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaee59a86102f150923b0cac6d4ff05107a84413028615d2d718bafd2dfb93dafef',1,'Isometry(Global Namespace)']]], - ['isometrytransformtype_834',['IsometryTransformType',['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#ad3ac890d85420ba78e16dab1983d1a80',1,'Eigen::Translation']]], - ['isones_835',['isOnes',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'Eigen::DenseBase::isOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'DenseBase< ArrayWrapper< ExpressionType > >::isOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'DenseBase< Solve< Decomposition, RhsType > >::isOnes()']]], - ['isopen_836',['isOpen',['../classcam_1_1Camera.html#a3a4e701bebbf1664aaa23f9574dae0fb',1,'cam::Camera::isOpen()'],['../classrobot_1_1types_1_1LimitSwitchData.html#ae5a9ddf4a720f8023c6387646b0f8b67',1,'robot::types::LimitSwitchData::isOpen()']]], - ['isopenclactivated_837',['isOpenCLActivated',['https://docs.opencv.org/4.2.0/d5/d96/namespacecv_1_1ocl.html#a587e0f34249ff186739c8df338402aee',1,'cv::ocl']]], - ['isopened_838',['isOpened',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa952c31f4e632595cd5ac107913f4fd1',1,'cv::FileStorage::isOpened()'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a9d2ca36789e7fcfe7a7be3b328038585',1,'cv::VideoCapture::isOpened()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a9a40803e5f671968ac9efa877c984d75',1,'cv::VideoWriter::isOpened()']]], - ['isopenedstream_839',['isOpenedStream',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a365b87a00227198d5835d65bf09ecc81',1,'cv::AVIWriteContainer']]], - ['isorthogonal_840',['isOrthogonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aefdc8e4e4c156fdd79a21479e75dcd8a',1,'Eigen::MatrixBase::isOrthogonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aefdc8e4e4c156fdd79a21479e75dcd8a',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isOrthogonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aefdc8e4e4c156fdd79a21479e75dcd8a',1,'MatrixBase< Solve< Decomposition, RhsType > >::isOrthogonal()']]], - ['isotropicpreconditionerfrompoints_841',['isotropicPreconditionerFromPoints',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga646945dfd23dd78577c04f98441668eb',1,'cv::sfm::isotropicPreconditionerFromPoints()'],['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga646945dfd23dd78577c04f98441668eb',1,'isotropicPreconditionerFromPoints()(Global Namespace)']]], - ['isparseoptflowestimator_842',['ISparseOptFlowEstimator',['https://docs.opencv.org/4.2.0/df/de2/classcv_1_1videostab_1_1ISparseOptFlowEstimator.html',1,'cv::videostab']]], - ['ispositive_843',['isPositive',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a5e1c6b7ba8d7b82575d6ffdc3bf35bcb',1,'Eigen::LDLT']]], - ['ispossiblematch_844',['isPossibleMatch',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#aaeca71427249a189e35e77066f25fc8b',1,'cv::DescriptorMatcher']]], - ['ispowerof2_845',['IsPowerOf2',['https://docs.opencv.org/4.2.0/da/db4/structcv_1_1cudev_1_1IsPowerOf2.html',1,'cv::cudev']]], - ['isprepassdone_5f_846',['isPrePassDone_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a27cb48b75a2390e88af1fa2d8c2f4c28',1,'cv::videostab::TwoPassStabilizer']]], - ['isprint_847',['isprint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acb62bfd8b68d18e2f7902f6bc953b5be',1,'std']]], - ['ispunct_848',['ispunct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a74f97c8b1d25427e90b431e45bfba150',1,'std']]], - ['isreal_849',['isReal',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a19df895cf4d23414e0872ec4f2ab8f94',1,'cv::dnn::DictValue::isReal()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a2b4bb5e70a940bc5543207387923f5aa',1,'cv::FileNode::isReal()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae37527361b2fd69e3d17167629122fea',1,'cv::Scalar_::isReal()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae37527361b2fd69e3d17167629122fea',1,'Scalar_< double >::isReal()']]], - ['isrightnodeleaf_850',['isRightNodeLeaf',['https://docs.opencv.org/4.2.0/df/d88/structHaarFeatureDescriptor32.html#a91d79fdfbd4c4c2ae53f0d33dd989c6a',1,'HaarFeatureDescriptor32']]], - ['isrightof_851',['isRightOf',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a3330f72eb0ace8a8b6faa43c3f606fdd',1,'cv::Subdiv2D']]], - ['isrlmorphologypossible_852',['isRLMorphologyPossible',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga85ed82296e9e9893dcbaa92b87837019',1,'cv::ximgproc::rl::isRLMorphologyPossible()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga85ed82296e9e9893dcbaa92b87837019',1,'isRLMorphologyPossible()(Global Namespace)']]], - ['isrowmajor_853',['IsRowMajor',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da406b6af91d61d348ba1c9764bdd66008',1,'Eigen::DenseBase::IsRowMajor'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da406b6af91d61d348ba1c9764bdd66008',1,'DenseBase< ArrayWrapper< ExpressionType > >::IsRowMajor'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da406b6af91d61d348ba1c9764bdd66008',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::IsRowMajor'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da406b6af91d61d348ba1c9764bdd66008',1,'DenseBase< Solve< Decomposition, RhsType > >::IsRowMajor']]], - ['isrunning_854',['isRunning',['../classutil_1_1AsyncTask.html#a43503af0b5f2252e5921364b3d6671a2',1,'util::AsyncTask']]], - ['isrunninginternal_855',['isRunningInternal',['../classutil_1_1AsyncTask.html#a20bdfa788fbca27e37507bec70d893ee',1,'util::AsyncTask']]], - ['isseparated_856',['isSeparated',['https://docs.opencv.org/4.2.0/d1/dfd/structcv_1_1optflow_1_1GPCPatchDescriptor.html#a9e2fd040535e62051dc84627edb73d4a',1,'cv::optflow::GPCPatchDescriptor']]], - ['isseq_857',['isSeq',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa2671f0a2a477a9f82d73e1bad1f5158',1,'cv::FileNode::isSeq() const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a0bd9a7a631170b4530417b325340624b',1,'cv::FileNode::isSeq(int flags)']]], - ['isspace_858',['isspace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a1adaf858b8edfbfdfcb64f9f6086827e',1,'std']]], - ['isstring_859',['isString',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a196377ee4f1e9e46de495a73ff85eea8',1,'cv::dnn::DictValue::isString()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#abbc622e50535692d0ca5f2e70589a175',1,'cv::FileNode::isString()']]], - ['issubmatrix_860',['isSubmatrix',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7963ba0ea28fcd0f50e5a9218a1e71ba',1,'cv::_InputArray::isSubmatrix()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ab34367822008627e80e144d7bba3bd70',1,'cv::Mat::isSubmatrix()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#acfba13176eea1e0e3db646a4e7a663a5',1,'cv::UMat::isSubmatrix()']]], - ['issubnormal_861',['isSubnormal',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9f1381799912b9539e1841b9ae2e9ed3',1,'cv::softdouble::isSubnormal()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5420ac5bdd327653ee0b90005c5c2b94',1,'cv::softfloat::isSubnormal()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5420ac5bdd327653ee0b90005c5c2b94',1,'isSubnormal() const(Global Namespace)']]], - ['issues_862',['Alignment issues',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__Alignement.html',1,'']]], - ['issurjective_863',['isSurjective',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a87a7d06e0b0479e5b56b19c2a4f56365',1,'Eigen::ColPivHouseholderQR::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a87a7d06e0b0479e5b56b19c2a4f56365',1,'ColPivHouseholderQR< MatrixType >::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a53dd287d3e1bbc548595d63880fd51bf',1,'Eigen::CompleteOrthogonalDecomposition::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aa3593db4708ce9079b0bdf219b99f57e',1,'Eigen::FullPivHouseholderQR::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a1f6222875fc3a181ee1544b9b36dfda5',1,'Eigen::FullPivLU::isSurjective()']]], - ['issymmetric_864',['isSymmetric',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a271b0287c4b2ec235504216f80ab0019',1,'Eigen::SparseLU']]], - ['istargetfg_865',['isTargetFg',['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html#a85d78ac41fa09c670af1e25704167a07',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerAdaBoostingTargetState::isTargetFg()'],['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html#aebf8d19315900b0a6ae42a731588eb5d',1,'cv::TrackerStateEstimatorMILBoosting::TrackerMILTargetState::isTargetFg()']]], - ['isthreadsafe_866',['isThreadSafe',['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a0bcd4038054223f4cda9f6c3eb7e7c11',1,'cv::detail::FeaturesMatcher']]], - ['istilted_867',['isTilted',['https://docs.opencv.org/4.2.0/df/d88/structHaarFeatureDescriptor32.html#a0dfa9fddc7a4c99325a2382c493a5111',1,'HaarFeatureDescriptor32']]], - ['istrackforgotten_868',['isTrackForgotten',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a22a40130f88f9f7fc8110d68cbfc96ce',1,'cv::tbm::ITrackerByMatching']]], - ['istrackvalid_869',['isTrackValid',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#ab0934009b83726268d925bd69ffd65f0',1,'cv::tbm::ITrackerByMatching']]], - ['istrained_870',['isTrained',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#aab380b59eb30b50254ef1b804774c4d8',1,'cv::ml::StatModel']]], - ['istream_871',['istream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00089.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga9a51d9b711a836df9c086f3a5e30b8b2',1,'std::istream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga9a51d9b711a836df9c086f3a5e30b8b2',1,'istream(Global Namespace)']]], - ['istream_2etcc_872',['istream.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00389.html',1,'']]], - ['istream_5fiterator_873',['istream_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07975.html',1,'std::istream_iterator< _Tp, _CharT, _Traits, _Dist >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07975.html#ad21a77186d51771382af6007e650b33c',1,'std::istream_iterator::istream_iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07975.html#a947cfbb26709a887a3e2b47782d8093f',1,'std::istream_iterator::istream_iterator(istream_type &__s)']]], - ['istream_5ftype_874',['istream_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a88fc8fbe18f938ebfad7c496ccafcd76',1,'std::istreambuf_iterator::istream_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a88fc8fbe18f938ebfad7c496ccafcd76',1,'std::istreambuf_iterator::istream_type']]], - ['istreambuf_5fiterator_875',['istreambuf_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html',1,'std::istreambuf_iterator< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a75654a594dd9fd94bcf6712f9c3b8d2c',1,'std::istreambuf_iterator::istreambuf_iterator() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#ac5abfcd042a670b72bdbb2fa3ee0d6f5',1,'std::istreambuf_iterator::istreambuf_iterator(istream_type &__s) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#af53baf53c052a0086f61f54cb4dfa337',1,'std::istreambuf_iterator::istreambuf_iterator(streambuf_type *__s) noexcept']]], - ['istreamsource_876',['IStreamSource',['https://docs.opencv.org/4.2.0/da/d03/classcv_1_1gapi_1_1wip_1_1IStreamSource.html',1,'cv::gapi::wip']]], - ['istringstream_877',['istringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga6d8fb6942dcb39300db6a403f5ba1fe6',1,'std::istringstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga6d8fb6942dcb39300db6a403f5ba1fe6',1,'istringstream(Global Namespace)']]], - ['isumat_878',['isUMat',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7e1555ee58814435df26535ff9380e2e',1,'cv::_InputArray']]], - ['isumat_5f_879',['isUmat_',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#af7da6346b5d17553e15fb312b75e17ac',1,'cv::superres::SuperResolution']]], - ['isumatvector_880',['isUMatVector',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a25688fd401f1f9e1d20f31c7f3c9467e',1,'cv::_InputArray']]], - ['isunaryfunction_881',['IsUnaryFunction',['https://docs.opencv.org/4.2.0/d6/d82/structcv_1_1cudev_1_1IsUnaryFunction.html',1,'cv::cudev']]], - ['isunitary_882',['isUnitary',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a7ee34ce202cac3eeea9cf20c9e4833',1,'Eigen::MatrixBase::isUnitary()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a7ee34ce202cac3eeea9cf20c9e4833',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isUnitary()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a7ee34ce202cac3eeea9cf20c9e4833',1,'MatrixBase< Solve< Decomposition, RhsType > >::isUnitary()']]], - ['isupper_883',['isupper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a50bacb17f1babb86a1239cdc0cf66089',1,'std']]], - ['isuppertriangular_884',['isUpperTriangular',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aae3ec1660bb4ac584220481c54ab4a64',1,'Eigen::MatrixBase::isUpperTriangular()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aae3ec1660bb4ac584220481c54ab4a64',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isUpperTriangular()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aae3ec1660bb4ac584220481c54ab4a64',1,'MatrixBase< Solve< Decomposition, RhsType > >::isUpperTriangular()']]], - ['isvalid_885',['isValid',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a67e9b5fba7b3a70a03db89484aecceb7',1,'cv::TermCriteria::isValid()'],['../classrobot_1_1types_1_1DataPoint.html#a6b0c843157658cd21cfd94808042cd7c',1,'robot::types::DataPoint::isValid()']]], - ['isvaliddepth_886',['isValidDepth',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaec2aff91f8f0600fb7024f57ca9c52c9',1,'cv::rgbd::isValidDepth(const float &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga34e1c9295a7216be59ca4da67d1f5eed',1,'cv::rgbd::isValidDepth(const double &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga74ef1e077263eb737b6349d3d3158f2f',1,'cv::rgbd::isValidDepth(const short int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gafb08f97f37ed0cda66e4f9c47828a0ff',1,'cv::rgbd::isValidDepth(const unsigned short int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga1d690fd424b88e2933705f641c59ac44',1,'cv::rgbd::isValidDepth(const int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga8821699754cadee8a0f04f0622b673c7',1,'cv::rgbd::isValidDepth(const unsigned int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaec2aff91f8f0600fb7024f57ca9c52c9',1,'isValidDepth(const float &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga34e1c9295a7216be59ca4da67d1f5eed',1,'isValidDepth(const double &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga74ef1e077263eb737b6349d3d3158f2f',1,'isValidDepth(const short int &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gafb08f97f37ed0cda66e4f9c47828a0ff',1,'isValidDepth(const unsigned short int &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga1d690fd424b88e2933705f641c59ac44',1,'isValidDepth(const int &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga8821699754cadee8a0f04f0622b673c7',1,'isValidDepth(const unsigned int &depth)(Global Namespace)']]], - ['isvector_887',['isVector',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#ad9a833a610fa8a02d1f840bd6f213086',1,'cv::_InputArray::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'Eigen::SparseMatrixBase::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< Transpose< MatrixType > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::isVector()']]], - ['isvectoratcompiletime_888',['IsVectorAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da1156955c8099c5072934b74c72654ed0',1,'Eigen::DenseBase::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da1156955c8099c5072934b74c72654ed0',1,'DenseBase< ArrayWrapper< ExpressionType > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da1156955c8099c5072934b74c72654ed0',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da1156955c8099c5072934b74c72654ed0',1,'DenseBase< Solve< Decomposition, RhsType > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a14a3f566ed2a074beddb8aef0223bfdf',1,'Eigen::SparseMatrixBase::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a14a3f566ed2a074beddb8aef0223bfdf',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a14a3f566ed2a074beddb8aef0223bfdf',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a14a3f566ed2a074beddb8aef0223bfdf',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a14a3f566ed2a074beddb8aef0223bfdf',1,'SparseMatrixBase< Transpose< MatrixType > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a14a3f566ed2a074beddb8aef0223bfdf',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::IsVectorAtCompileTime']]], - ['isvirtual_889',['isvirtual',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a7380e9400279208cdd04ea836f79df8d',1,'cv::Subdiv2D::Vertex']]], - ['isxdigit_890',['isxdigit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2176db62da3573c57096dfe6c2221cb3',1,'std']]], - ['iszero_891',['isZero',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'Eigen::DenseBase::isZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'DenseBase< ArrayWrapper< ExpressionType > >::isZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'DenseBase< Solve< Decomposition, RhsType > >::isZero()']]], - ['it_892',['it',['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html#a0d04ec0b612fc292dd876b55a8bda291',1,'cv::MatCommaInitializer_']]], - ['items_893',['items',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a916a6ba75ec7624e9c6c977a52d6fd17.html#a916a6ba75ec7624e9c6c977a52d6fd17',1,'nlohmann::basic_json::items() noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4faaed730a81347f2f01e93f37c73823.html#a4faaed730a81347f2f01e93f37c73823',1,'nlohmann::basic_json::items() const noexcept']]], - ['iter_5fswap_894',['iter_swap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gad93e66478d9a63e5777733be09931388',1,'std::iter_swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gad93e66478d9a63e5777733be09931388',1,'iter_swap()(Global Namespace)']]], - ['iter_5ftype_895',['iter_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#ae6380ee2883b3ebe0d9aadd2984fd26f',1,'std::money_get::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#ae6380ee2883b3ebe0d9aadd2984fd26f',1,'std::money_get::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a7249c382c88e14da45e08100febe637d',1,'std::money_put::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a7249c382c88e14da45e08100febe637d',1,'std::money_put::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a54c3ce0bfdb7fb56c3ffe09b355fdefb',1,'std::num_get::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a54c3ce0bfdb7fb56c3ffe09b355fdefb',1,'std::num_get::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ad2381689c28b46237f7615e0de6028fa',1,'std::num_put::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ad2381689c28b46237f7615e0de6028fa',1,'std::num_put::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a4d4958640ecfa742e7d27137de746ac1',1,'std::time_get::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a4d4958640ecfa742e7d27137de746ac1',1,'std::time_get::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#aaac7d8b45c25d36c14efe8876af1d65e',1,'std::time_put::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#aaac7d8b45c25d36c14efe8876af1d65e',1,'std::time_put::iter_type']]], - ['iterate_896',['iterate',['https://docs.opencv.org/4.2.0/d5/da0/classcv_1_1ximgproc_1_1SuperpixelLSC.html#a651e84e8a99145df8b560858d1fa070b',1,'cv::ximgproc::SuperpixelLSC::iterate()'],['https://docs.opencv.org/4.2.0/df/d81/classcv_1_1ximgproc_1_1SuperpixelSEEDS.html#afc35736ae52b277a1708b54037598cbb',1,'cv::ximgproc::SuperpixelSEEDS::iterate()'],['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1ximgproc_1_1SuperpixelSLIC.html#add5e65da972e5e00ce1753ea862f380c',1,'cv::ximgproc::SuperpixelSLIC::iterate()']]], - ['iterationinit_897',['iterationInit',['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#ad0d03e8efe6f76c284d075536ae4adde',1,'cv::TrackerBoosting::Params']]], - ['iterationnum_898',['iterationNum',['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html#a4190f430eee681b7ce043994f5d867bb',1,'cv::TrackerSamplerPF::Params']]], - ['iterations_899',['iterations',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#ae778dd098bd5e6655625b20b1e9f15da',1,'Eigen::IterativeSolverBase::iterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#afbecc6d0ab1de42be9db79428da48ab6',1,'Eigen::RealQZ::iterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#afbecc6d0ab1de42be9db79428da48ab6',1,'RealQZ< MatrixType >::iterations()']]], - ['iterative_900',['ITERATIVE',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#gga6a4ee3a5f9fd35c1b350a1049d8abc9da42216ed5e5593d09ba0a26576061c33f',1,'cv::ft::ITERATIVE'],['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#gga6a4ee3a5f9fd35c1b350a1049d8abc9da42216ed5e5593d09ba0a26576061c33f',1,'ITERATIVE(Global Namespace)']]], - ['iterativelinearsolvers_20module_901',['IterativeLinearSolvers module',['https://eigen.tuxfamily.org/dox/group__IterativeLinearSolvers__Module.html',1,'']]], - ['iterativesolverbase_902',['IterativeSolverBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html',1,'Eigen::IterativeSolverBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a0922f2be45082690d7734aa6732fc493',1,'Eigen::IterativeSolverBase::IterativeSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a3c68fe3cd929ea1ff8a0d4cbcd65ebad',1,'Eigen::IterativeSolverBase::IterativeSolverBase(const EigenBase< MatrixDerived > &A)']]], - ['iterator_903',['iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11935.html',1,'__gnu_pbds::detail::pat_trie_base::_Inode< _ATraits, Metadata >::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09895.html',1,'std::experimental::filesystem::v1::path::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'std::iterator< _Category, _Tp, _Distance, _Pointer, _Reference >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00092.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a04a2e3cf31e6396607ab6d18be91fd61',1,'cv::Mat_::iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a04a2e3cf31e6396607ab6d18be91fd61',1,'Mat_< double >::iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a04a2e3cf31e6396607ab6d18be91fd61',1,'Mat_< float >::iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a04a2e3cf31e6396607ab6d18be91fd61',1,'Mat_< uchar >::iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a04a2e3cf31e6396607ab6d18be91fd61',1,'Mat_< unsigned char >::iterator'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#aa766accd9ac415bea90019010f58cac6',1,'cv::SparseMat::iterator'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#aad69108f160c710a9e39e540790cd630',1,'cv::SparseMat_::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab67be28282428ca9d7bd2f77a5507c1a',1,'std::set::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab67be28282428ca9d7bd2f77a5507c1a',1,'std::set::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0526d137ece77ce98d550cd2d6fd1816',1,'std::unordered_map::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0526d137ece77ce98d550cd2d6fd1816',1,'std::unordered_map::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a0fffce26090303390cc7fce06b5f6615',1,'std::unordered_multimap::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a0fffce26090303390cc7fce06b5f6615',1,'std::unordered_multimap::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ad30c938c0f7a7d7d78471da27420efc0',1,'std::unordered_multiset::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ad30c938c0f7a7d7d78471da27420efc0',1,'std::unordered_multiset::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a02fe876578c29d71f3b0e63ae959fc9e',1,'std::unordered_set::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a02fe876578c29d71f3b0e63ae959fc9e',1,'std::unordered_set::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0526d137ece77ce98d550cd2d6fd1816',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0526d137ece77ce98d550cd2d6fd1816',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af5130902770642a1a057a99c397d357d',1,'Eigen::DenseBase::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af5130902770642a1a057a99c397d357d',1,'DenseBase< ArrayWrapper< ExpressionType > >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af5130902770642a1a057a99c397d357d',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af5130902770642a1a057a99c397d357d',1,'DenseBase< Solve< Decomposition, RhsType > >::iterator'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa549b2b382916b3baafb526e5cb410bd.html#aa549b2b382916b3baafb526e5cb410bd',1,'nlohmann::basic_json::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'Eigen::VectorwiseOp::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const Derived, Horizontal >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const Derived, Vertical >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::iterator']]], - ['iterator_20tags_904',['Iterator Tags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01514.html',1,'']]], - ['iterator_2eh_905',['iterator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00908.html',1,'']]], - ['iterator_2ehpp_906',['iterator.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01460.html',1,'']]], - ['iterator_3c_20input_5fiterator_5ftag_2c_20_5fchart_2c_20_5ftraits_3a_3aoff_5ftype_2c_20_5fchart_20_2a_2c_20_5fchart_20_3e_907',['iterator< input_iterator_tag, _CharT, _Traits::off_type, _CharT *, _CharT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], - ['iterator_3c_20input_5fiterator_5ftag_2c_20_5ftp_2c_20_5fdist_2c_20const_20_5ftp_20_2a_2c_20const_20_5ftp_20_26_20_3e_908',['iterator< input_iterator_tag, _Tp, _Dist, const _Tp *, const _Tp & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], - ['iterator_3c_20iterator_5ftraits_3c_20_5fiterator_20_3e_3a_3aiterator_5fcategory_2c_20iterator_5ftraits_3c_20_5fiterator_20_3e_3a_3avalue_5ftype_2c_20iterator_5ftraits_3c_20_5fiterator_20_3e_3a_3adifference_5ftype_2c_20iterator_5ftraits_3c_20_5fiterator_20_3e_3a_3apointer_2c_20iterator_5ftraits_3c_20_5fiterator_20_3e_3a_3areference_20_3e_909',['iterator< iterator_traits< _Iterator >::iterator_category, iterator_traits< _Iterator >::value_type, iterator_traits< _Iterator >::difference_type, iterator_traits< _Iterator >::pointer, iterator_traits< _Iterator >::reference >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], - ['iterator_3c_20output_5fiterator_5ftag_2c_20void_2c_20void_2c_20void_2c_20void_20_3e_910',['iterator< output_iterator_tag, void, void, void, void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], - ['iterator_3c_20std_3a_3aoutput_5fiterator_5ftag_2c_20void_2c_20void_2c_20void_2c_20void_20_3e_911',['iterator< std::output_iterator_tag, void, void, void, void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], - ['iterator_3c_20std_3a_3arandom_5faccess_5fiterator_5ftag_2c_20_5fchart_20_3e_912',['iterator< std::random_access_iterator_tag, _CharT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], - ['iterator_3c_20std_3a_3arandom_5faccess_5fiterator_5ftag_2c_20bool_20_3e_913',['iterator< std::random_access_iterator_tag, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], - ['iterator_5f_914',['iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html',1,'iterator_'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a53fb6c07d7d3153087d79ca22c1a8ec0',1,'iterator_::iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a43fbe36e902b02465f9cd20a69cbd9a4',1,'iterator_::iterator_(pointer p_value, PB_DS_GEN_POS pos, PB_DS_CLASS_C_DEC *p_tbl)']]], - ['iterator_5fcategory_915',['iterator_category',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#abe9ccc65ff06227d9d3a22f6540d164f',1,'cv::MatConstIterator::iterator_category'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a982c1f3b60466325f8156197ed4d52b8',1,'cv::MatConstIterator_::iterator_category'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a44c7cc2143ee5600a2e4d2a62e27278d',1,'cv::MatIterator_::iterator_category'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a72422dbb0a1afd0045309aeab95cdbd7',1,'cv::SparseMatConstIterator_::iterator_category'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a032fb509c53ad44f22ae833876dd113f',1,'cv::SparseMatIterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#ae7cdc704c64581039293828b5c6f4b15',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#ae7cdc704c64581039293828b5c6f4b15',1,'__gnu_pbds::detail::bin_search_tree_node_it_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#aac3f2af936b4120fe980c2d7075dd6f4',1,'__gnu_pbds::detail::binary_heap_const_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a0d1b6774adedb170ee1ed23fcff30ba2',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#abfb76ff099663b004647df58f5caea7a',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#ad578e2244dc434c3efe2c432b2ed6e49',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#af444809607ea316622a983fcd8b9e1d3',1,'const_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< input_iterator_tag, _CharT, _Traits::off_type, _CharT *, _CharT >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< input_iterator_tag, _Tp, _Dist, const _Tp *, const _Tp & >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< iterator_traits< _Iterator >::iterator_category, iterator_traits< _Iterator >::value_type, iterator_traits< _Iterator >::difference_type, iterator_traits< _Iterator >::pointer, iterator_traits< _Iterator >::reference >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< output_iterator_tag, void, void, void, void >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< std::output_iterator_tag, void, void, void, void >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< std::random_access_iterator_tag, _CharT >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< std::random_access_iterator_tag, bool >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a304ce8f2d8163bcd83c095521b6fa1b1',1,'iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#ac5b6dc54bff59e85201e0c4c6c3cd412',1,'point_const_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#abe8100b521572dbff3f33d9a4d7779eb',1,'point_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::back_insert_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::front_insert_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::insert_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::istream_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::istreambuf_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::ostream_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::ostreambuf_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::raw_storage_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::reverse_iterator::iterator_category']]], - ['iterator_5ffn_5fimps_2ehpp_916',['iterator_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01307.html',1,'']]], - ['iterator_5ftracker_2eh_917',['iterator_tracker.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00815.html',1,'']]], - ['iterator_5ftraits_3c_20_5ftp_20_2a_20_3e_918',['iterator_traits< _Tp * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07727.html',1,'std']]], - ['iterator_5ftraits_3c_20const_20_5ftp_20_2a_20_3e_919',['iterator_traits< const _Tp * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07731.html',1,'std']]], - ['iterator_5fwrapper_920',['iterator_wrapper',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a22e2e5b0e68d9d7c63be2cada5187259.html#a22e2e5b0e68d9d7c63be2cada5187259',1,'nlohmann::basic_json::iterator_wrapper(reference ref) noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3710ff8c5a1cbedb4f75b700a8962d5c.html#a3710ff8c5a1cbedb4f75b700a8962d5c',1,'nlohmann::basic_json::iterator_wrapper(const_reference ref) noexcept']]], - ['iterators_921',['Iterators',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html',1,'']]], - ['iterators_20and_20algorithms_922',['STL iterators and algorithms',['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'']]], - ['itercounts_923',['iterCounts',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a3e2e55b3264b1b95746f0f2b9cba9cb2',1,'cv::rgbd::FastICPOdometry::iterCounts'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a9e00bb579d842cc1860aea11cebdd8a1',1,'cv::rgbd::ICPOdometry::iterCounts'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a7629d0bb783e2a749ae8ace23ac92b06',1,'cv::rgbd::RgbdICPOdometry::iterCounts'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#ac4eb3320bb05a5ae2c55c05072f728ff',1,'cv::rgbd::RgbdOdometry::iterCounts']]], - ['iterdepth_924',['iterdepth',['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a12f058bd6c7ea7e2b87c65eaa3054e0e',1,'cv::NAryMatIterator']]], - ['itrackerbymatching_925',['ITrackerByMatching',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html',1,'cv::tbm']]], - ['its_20use_20for_20image_20processing_926',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], - ['iword_927',['iword',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_ios< char, _Traits >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_iostream< char >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_istream< char >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_istream< char, _Traits >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_ostream< char >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_ostream< char, _Traits >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_fstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ifstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ios::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_iostream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_istream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_istringstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ofstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ostream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ostringstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_stringstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::ios_base::iword()']]], - ['iwriter_928',['iwriter',['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#ab6567d64fd202fe34284f0b11b79454c',1,'cv::VideoWriter']]], - ['iwscale_929',['iwscale',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a097562f84bb9d6a6bf28f53369fc26c2',1,'cv::ocl::KernelArg']]] + ['image_53',['Image',['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html',1,'cv::gapi::wip::draw::Image'],['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html#ab9cfd217c05ec962a6f39e685ec05ded',1,'cv::gapi::wip::draw::Image::Image()'],['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'Load and Display an Image'],['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'Load, Modify, and Save an Image']]], + ['image_54',['image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'Binary descriptors for lines extracted from an image'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'Binary morphology on run-length encoded image'],['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'Changing the contrast and brightness of an image!'],['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'Face landmark detection in an image'],['https://docs.opencv.org/4.2.0/df/d0d/tutorial_find_contours.html',1,'Finding contours in your image'],['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html#a7ee1a6035004ce7e47cc8e86be65adee',1,'cv::stereo::CensusKernel::image'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#ab7b18cb999c2d1eb89e8ab1009e32c78',1,'cv::stereo::MCTKernel::image'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#a36442396ea4d13a98b9c3214bf899937',1,'cv::stereo::ModifiedCsCensus::image'],['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#ae10b682c0a4e3ae162f0723e23034750',1,'cv::stereo::MVKernel::image'],['https://docs.opencv.org/4.2.0/de/d3f/structcv_1_1datasets_1_1OR__imagenetObj.html#ac87669638322c3241236a4d2d8cb2015',1,'cv::datasets::OR_imagenetObj::image'],['https://docs.opencv.org/4.2.0/d0/d2c/structcv_1_1datasets_1_1OR__mnistObj.html#abee9e6e757f3f4db56fff2c71fe342ec',1,'cv::datasets::OR_mnistObj::image'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#a767de58fc59ade9c29ebf090a01b6317',1,'cv::rgbd::RgbdFrame::image'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a0893985d2dab367baa6e57c6fd0c4956',1,'Eigen::FullPivLU::image()']]], + ['image_20and_20channel_20composition_20functions_55',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], + ['image_20blenders_56',['Image Blenders',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html',1,'']]], + ['image_20container_57',['Mat - The Basic Image Container',['https://docs.opencv.org/4.2.0/d6/d6d/tutorial_mat_the_basic_image_container.html',1,'']]], + ['image_20denoising_58',['Image Denoising',['https://docs.opencv.org/4.2.0/d5/d69/tutorial_py_non_local_means.html',1,'']]], + ['image_20file_20reading_20and_20writing_59',['Image file reading and writing',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html',1,'']]], + ['image_20filtering_60',['Image Filtering',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html',1,'Image Filtering'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html',1,'Image Filtering']]], + ['image_20filters_61',['Graph API: Image filters',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html',1,'']]], + ['image_20from_20one_20color_20space_20to_20another_62',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], + ['image_20gradients_63',['Image Gradients',['https://docs.opencv.org/4.2.0/d5/d0f/tutorial_py_gradients.html',1,'Image Gradients'],['https://docs.opencv.org/4.2.0/da/d85/tutorial_js_gradients.html',1,'Image Gradients']]], + ['image_20hashing_20algorithms_64',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], + ['image_20inpainting_65',['Image Inpainting',['https://docs.opencv.org/4.2.0/df/d3d/tutorial_py_inpainting.html',1,'Image Inpainting'],['https://docs.opencv.org/4.2.0/dc/d2f/tutorial_xphoto_inpainting.html',1,'Image Inpainting']]], + ['image_20input_20and_20output_20imgcodecs_20module_66',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], + ['image_20moments_67',['Image Moments',['https://docs.opencv.org/4.2.0/d0/d49/tutorial_moments.html',1,'']]], + ['image_20processing_68',['Image Processing',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html',1,'Extended Image Processing'],['https://docs.opencv.org/4.2.0/d7/dbd/group__imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d2/df0/tutorial_js_table_of_contents_imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html',1,'NPPST Image Processing'],['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'OpenCV iOS - Image Processing']]], + ['image_20processing_69',['image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'Discovering the human retina and its use for image processing'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html',1,'Fuzzy image processing']]], + ['image_20processing_20based_20on_20fuzzy_20mathematics_70',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], + ['image_20processing_20for_20video_20capture_71',['Image Processing for Video Capture',['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'']]], + ['image_20processing_20functionality_72',['G-API Image processing functionality',['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'']]], + ['image_20processing_20imgproc_20module_73',['Image Processing (imgproc module)',['https://docs.opencv.org/4.2.0/d7/da8/tutorial_table_of_content_imgproc.html',1,'']]], + ['image_20processing_20in_20opencv_74',['Image Processing in OpenCV',['https://docs.opencv.org/4.2.0/d2/d96/tutorial_py_table_of_contents_imgproc.html',1,'']]], + ['image_20processing_20tutorials_75',['Fuzzy image processing tutorials',['https://docs.opencv.org/4.2.0/d7/d36/tutorial_fuzzy.html',1,'']]], + ['image_20pyramids_76',['Image Pyramids',['https://docs.opencv.org/4.2.0/d4/d1f/tutorial_pyramids.html',1,'Image Pyramids'],['https://docs.opencv.org/4.2.0/dc/dff/tutorial_py_pyramids.html',1,'Image Pyramids'],['https://docs.opencv.org/4.2.0/d5/d0f/tutorial_js_pyramids.html',1,'Image Pyramids']]], + ['image_20quality_20analysis_20iqa_20api_77',['Image Quality Analysis (IQA) API',['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'']]], + ['image_20registration_78',['Image Registration',['https://docs.opencv.org/4.2.0/dc/def/group__datasets__ir.html',1,'Image Registration'],['https://docs.opencv.org/4.2.0/db/d61/group__reg.html',1,'Image Registration']]], + ['image_20segmentation_79',['Image Segmentation',['https://docs.opencv.org/4.2.0/dc/d29/group__hfs.html',1,'Hierarchical Feature Selection for Efficient Image Segmentation'],['https://docs.opencv.org/4.2.0/d3/d2d/group__datasets__is.html',1,'Image Segmentation']]], + ['image_20segmentation_80',['Image segmentation',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html',1,'']]], + ['image_20segmentation_20by_20a_20gradient_20structure_20tensor_81',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], + ['image_20segmentation_20on_20g_20api_82',['Porting anisotropic image segmentation on G-API',['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'']]], + ['image_20segmentation_20with_20distance_20transform_20and_20watershed_20algorithm_83',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], + ['image_20segmentation_20with_20watershed_20algorithm_84',['Image Segmentation with Watershed Algorithm',['https://docs.opencv.org/4.2.0/d3/db4/tutorial_py_watershed.html',1,'Image Segmentation with Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d7/d1c/tutorial_js_watershed.html',1,'Image Segmentation with Watershed Algorithm']]], + ['image_20thresholding_85',['Image Thresholding',['https://docs.opencv.org/4.2.0/d7/d4d/tutorial_py_thresholding.html',1,'Image Thresholding'],['https://docs.opencv.org/4.2.0/d7/dd0/tutorial_js_thresholding.html',1,'Image Thresholding']]], + ['image_20transformations_86',['Image Transformations',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html',1,'Geometric Image Transformations'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html',1,'Miscellaneous Image Transformations']]], + ['image_20transforms_20in_20opencv_87',['Image Transforms in OpenCV',['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'']]], + ['image_20transforms_20in_20opencv_20js_88',['Image Transforms in OpenCV.js',['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'']]], + ['image_20warping_89',['Image Warping',['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html',1,'']]], + ['image_20watch_3a_20viewing_20in_20memory_20images_20in_20the_20visual_20studio_20debugger_90',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['image1_91',['image1',['https://docs.opencv.org/4.2.0/d9/d2d/structcv_1_1datasets_1_1FR__lfwObj.html#abb6fe093bd834f81b0cd6d56c5b4e196',1,'cv::datasets::FR_lfwObj']]], + ['image2_92',['image2',['https://docs.opencv.org/4.2.0/d9/d2d/structcv_1_1datasets_1_1FR__lfwObj.html#a5a7bbeaa928253ce0e3bc81b9103e417',1,'cv::datasets::FR_lfwObj']]], + ['image2d_93',['Image2D',['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html',1,'cv::ocl::Image2D'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#aca032d597c124ac6de9fb99651d7dbde',1,'cv::ocl::Image2D::Image2D()'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#add72e2232b399e958dde24794b2ce798',1,'cv::ocl::Image2D::Image2D(const UMat &src, bool norm=false, bool alias=false)'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#a7db0945ce066ef26226773382a177e68',1,'cv::ocl::Image2D::Image2D(const Image2D &i)']]], + ['image2dmaxheight_94',['image2DMaxHeight',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0d604ced5333c5d611b3beae76bb9363',1,'cv::ocl::Device']]], + ['image2dmaxwidth_95',['image2DMaxWidth',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#af6ceb593795e6993dd8da6ae804eae7f',1,'cv::ocl::Device']]], + ['image3dmaxdepth_96',['image3DMaxDepth',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a11ef7435cb679fabecdb34e6d9ea6d4a',1,'cv::ocl::Device']]], + ['image3dmaxheight_97',['image3DMaxHeight',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a6c1b13f92f9455f1c8b6f32fa18457c4',1,'cv::ocl::Device']]], + ['image3dmaxwidth_98',['image3DMaxWidth',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a1af061caf478f15609ce31fa065820dc',1,'cv::ocl::Device']]], + ['image_5fheight_99',['image_height',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a70a6a01ef3e603a76ccacad7d9141894',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['image_5fmanipulation_2emarkdown_100',['image_manipulation.markdown',['https://docs.opencv.org/4.2.0/d6/dd9/image__manipulation_8markdown.html',1,'']]], + ['image_5fwidth_101',['image_width',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#ad402b2464ffeca81b231bad362ce5eb3',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['imagebaseaddressalignment_102',['imageBaseAddressAlignment',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ac2a1da702ac445d6fcfb3fcba6d8f2fa',1,'cv::ocl::Device']]], + ['imagefeatures_103',['ImageFeatures',['https://docs.opencv.org/4.2.0/d4/db5/structcv_1_1detail_1_1ImageFeatures.html',1,'cv::detail']]], + ['imagefrombuffersupport_104',['imageFromBufferSupport',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ad62349c834402cce5d669f96147cf1da',1,'cv::ocl::Device']]], + ['imageheight_105',['imageHeight',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html#aabe73045bfa26b6b9564f50f2ad8e926',1,'cv::datasets::cameraParam::imageHeight'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a3aeba5c58aa31e3fc1b61819646d3b85',1,'CvAbstractCamera::imageHeight']]], + ['imagemaxarraysize_106',['imageMaxArraySize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a28a636515d6d600ba73566ffc88deabc',1,'cv::ocl::Device']]], + ['imagemaxbuffersize_107',['imageMaxBufferSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ae8affe34b8862e78ce89d2fcf7c2c6c2',1,'cv::ocl::Device']]], + ['imagemeankernelsize_108',['imageMeanKernelSize',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a04c8fb11c40d6a9885dfa3f3a2012699',1,'cv::stereo']]], + ['imagemotionestimatorbase_109',['ImageMotionEstimatorBase',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html',1,'cv::videostab::ImageMotionEstimatorBase'],['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html#a57edcbe22bc6b8aefd80ea7de0f2a2a8',1,'cv::videostab::ImageMotionEstimatorBase::ImageMotionEstimatorBase()']]], + ['imagename_110',['imageName',['https://docs.opencv.org/4.2.0/d9/dff/structcv_1_1datasets_1_1IR__affineObj.html#a5e7c316ff2b58e6df6c81df421f37d75',1,'cv::datasets::IR_affineObj::imageName'],['https://docs.opencv.org/4.2.0/d8/d65/structcv_1_1datasets_1_1IS__weizmannObj.html#ae5b458a3d24032c463fb0bb7060c041b',1,'cv::datasets::IS_weizmannObj::imageName'],['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html#acc4e0ae734d4daedd1764f577fb7aa3a',1,'cv::datasets::MSM_epflObj::imageName'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1datasets_1_1MSM__middleburyObj.html#a9ebf5ae5b618ff7a1ac72cde7f8e7027',1,'cv::datasets::MSM_middleburyObj::imageName'],['https://docs.opencv.org/4.2.0/dc/d1e/structcv_1_1datasets_1_1SR__bsdsObj.html#a18fe7840effc15b4c02eeb3cc7aeb43d',1,'cv::datasets::SR_bsdsObj::imageName'],['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1datasets_1_1SR__div2kObj.html#afe31c65e4dad1adc430b8180a3610ec9',1,'cv::datasets::SR_div2kObj::imageName'],['https://docs.opencv.org/4.2.0/da/dad/structcv_1_1datasets_1_1SR__general100Obj.html#a4188b3afa218140e93fe37cd6863c97f',1,'cv::datasets::SR_general100Obj::imageName']]], + ['imagenames_111',['imageNames',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#ace1275a3bdec76f6f006ca7b6b11cad7',1,'cv::datasets::HPE_humanevaObj::imageNames'],['https://docs.opencv.org/4.2.0/dd/ded/structcv_1_1datasets_1_1PD__caltechObj.html#ab45cfe4e0b04e8abcb91f541a10d33da',1,'cv::datasets::PD_caltechObj::imageNames']]], + ['imagepath_112',['imagePath',['https://docs.opencv.org/4.2.0/dd/d88/structcv_1_1datasets_1_1TRACK__alovObj.html#a8ba7c5780895da2eeb126dc6f9f229fd',1,'cv::datasets::TRACK_alovObj::imagePath'],['https://docs.opencv.org/4.2.0/d9/d36/structcv_1_1datasets_1_1TRACK__votObj.html#a5b071a222aa3d9058bdc20cf1cf08771',1,'cv::datasets::TRACK_votObj::imagePath']]], + ['imagepitchalignment_113',['imagePitchAlignment',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a909d421e167958dd1113a91d160f406f',1,'cv::ocl::Device']]], + ['imagepyramid_114',['ImagePyramid',['https://docs.opencv.org/4.2.0/d2/d77/classcv_1_1cuda_1_1ImagePyramid.html',1,'cv::cuda']]], + ['images_115',['Images',['https://docs.opencv.org/4.2.0/d0/d86/tutorial_py_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/d3/df2/tutorial_py_basic_ops.html',1,'Basic Operations on Images'],['https://docs.opencv.org/4.2.0/de/d06/tutorial_js_basic_ops.html',1,'Basic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d53/tutorial_py_depthmap.html',1,'Depth Map from Stereo Images'],['https://docs.opencv.org/4.2.0/da/d6e/tutorial_py_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dd/d52/tutorial_js_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dc/d2e/tutorial_py_image_display.html',1,'Getting Started with Images'],['https://docs.opencv.org/4.2.0/df/d24/tutorial_js_image_display.html',1,'Getting Started with Images'],['https://docs.opencv.org/4.2.0/dc/dd3/tutorial_gausian_median_blur_bilateral_filter.html',1,'Smoothing Images'],['https://docs.opencv.org/4.2.0/d4/d13/tutorial_py_filtering.html',1,'Smoothing Images'],['https://docs.opencv.org/4.2.0/dd/d6a/tutorial_js_filtering.html',1,'Smoothing Images']]], + ['images_116',['images',['https://docs.opencv.org/4.2.0/dc/da3/tutorial_copyMakeBorder.html',1,'Adding borders to your images'],['https://docs.opencv.org/4.2.0/d1/d64/structcv_1_1datasets_1_1cameraPos.html#ad8a7cbe833f22c59cbaa12af0320ec40',1,'cv::datasets::cameraPos::images'],['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html#a76b07b4517571cc5a3f2fafa4a4a409e',1,'cv::datasets::SLAM_kittiObj::images'],['https://docs.opencv.org/4.2.0/d5/d98/tutorial_mat_operations.html',1,'Operations with images']]], + ['images_20causing_20optical_20illusions_117',['Processing images causing optical illusions',['https://docs.opencv.org/4.2.0/d7/d8f/tutorial_bioinspired_retina_illusion.html',1,'']]], + ['images_20in_20the_20visual_20studio_20debugger_118',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_119',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], + ['images_20matching_120',['Features Finding and Images Matching',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'']]], + ['images_20stitching_121',['Images stitching',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html',1,'']]], + ['images_20stitching_20stitching_20module_122',['Images stitching (stitching module)',['https://docs.opencv.org/4.2.0/d0/d33/tutorial_table_of_content_stitching.html',1,'']]], + ['images_20using_20opencv_123',['Adding (blending) two images using OpenCV',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_adding_images.html',1,'']]], + ['images_20warping_124',['Images Warping',['https://docs.opencv.org/4.2.0/d0/dfa/group__stitching__warp.html',1,'']]], + ['images_3a_20multi_20output_125',['Upscaling images: multi-output',['https://docs.opencv.org/4.2.0/d6/dca/tutorial_dnn_superres_upscale_image_multi.html',1,'']]], + ['images_3a_20single_20output_126',['Upscaling images: single-output',['https://docs.opencv.org/4.2.0/d5/d29/tutorial_dnn_superres_upscale_image_single.html',1,'']]], + ['images_5f_127',['images_',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a681e67ac1e0b06c5b4d7ef15fc5eb0b0',1,'cv::detail::PairwiseSeamFinder']]], + ['imagesfromblob_128',['imagesFromBlob',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga4051b5fa2ed5f54b76c059a8625df9f5',1,'cv::dnn::imagesFromBlob()'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga4051b5fa2ed5f54b76c059a8625df9f5',1,'imagesFromBlob()(Global Namespace)']]], + ['imagestop_129',['imageStop',['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html#a450f0ca8718251bd6543912e7d183c92',1,'cv::stereo::CensusKernel::imageStop'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a17333f338a128b7f2a8513cf6f13a093',1,'cv::stereo::MCTKernel::imageStop'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#af9d600b3f05c0831718c495a5c7bf4af',1,'cv::stereo::ModifiedCsCensus::imageStop']]], + ['imagesupport_130',['imageSupport',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0fbeab8f04dfce8a23eb2b5ad01ffbce',1,'cv::ocl::Device']]], + ['imagetype_131',['imageType',['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#ga4d28f23013f06ead1ded84a16d514805',1,'cv::datasets::imageType'],['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#ga4d28f23013f06ead1ded84a16d514805',1,'imageType(Global Namespace)']]], + ['imagewidth_132',['imageWidth',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html#aa6eb6d891582b1815e5190624f9ebd3a',1,'cv::datasets::cameraParam::imageWidth'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a9ce69702c4608e60386884e5f7c233cf',1,'CvAbstractCamera::imageWidth']]], + ['imaging_133',['High Dynamic Range Imaging',['https://docs.opencv.org/4.2.0/d3/db7/tutorial_hdr_imaging.html',1,'']]], + ['imaging_134',['HDR imaging',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html',1,'']]], + ['imbue_135',['imbue',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'__gnu_cxx::enc_filebuf::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'__gnu_cxx::stdio_filebuf::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'__gnu_cxx::stdio_sync_filebuf::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'basic_filebuf< char_type, traits_type >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'basic_ios< char, _Traits >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'basic_iostream< char >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'basic_istream< char >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'basic_istream< char, _Traits >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'basic_ostream< char >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'basic_ostream< char, _Traits >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'basic_streambuf< _Elem, _Tr >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'basic_streambuf< char, _Traits >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'basic_streambuf< char, char_traits< char > >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ae1d71eed7ede0411f443426e1d0b781d',1,'regex_traits< _CharType >::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'std::basic_filebuf::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_fstream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_ifstream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_ios::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_iostream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_istream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_istringstream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_ofstream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_ostream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_ostringstream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a47e4d0a05a45fc95da8c061c33789004',1,'std::basic_regex::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'std::basic_streambuf::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'std::basic_stringbuf::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0aee263fdd9d10e05634c8b8d0f2114e',1,'std::basic_stringstream::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a29b144ecf437562b7cc05027f3e5a608',1,'std::ios_base::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ae1d71eed7ede0411f443426e1d0b781d',1,'std::regex_traits::imbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#affba476244b59486bd630e26ca375b0f',1,'std::wbuffer_convert::imbue()']]], + ['imdecode_136',['imdecode',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga26a67788faa58ade337f8d28ba0eb19e',1,'cv::imdecode(InputArray buf, int flags)'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga5a0acefe5cbe0a81e904e452ec7ca733',1,'cv::imdecode(InputArray buf, int flags, Mat *dst)'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga26a67788faa58ade337f8d28ba0eb19e',1,'imdecode(InputArray buf, int flags)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga5a0acefe5cbe0a81e904e452ec7ca733',1,'imdecode(InputArray buf, int flags, Mat *dst)(Global Namespace)']]], + ['imencode_137',['imencode',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga461f9ac09887e47797a54567df3b8b63',1,'cv::imencode()'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga461f9ac09887e47797a54567df3b8b63',1,'imencode()(Global Namespace)']]], + ['img_138',['img',['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html#aff97be87fcbce5f77a0a4920233c38ca',1,'cv::gapi::wip::draw::Image']]], + ['img_5fhash_2ehpp_139',['img_hash.hpp',['https://docs.opencv.org/4.2.0/d4/d59/img__hash_8hpp.html',1,'']]], + ['img_5fhash_5fbase_2ehpp_140',['img_hash_base.hpp',['https://docs.opencv.org/4.2.0/d9/db6/img__hash__base_8hpp.html',1,'']]], + ['img_5fidx_141',['img_idx',['https://docs.opencv.org/4.2.0/d4/db5/structcv_1_1detail_1_1ImageFeatures.html#a323db3650a49ac613aa22e5847d11402',1,'cv::detail::ImageFeatures']]], + ['img_5fsize_142',['img_size',['https://docs.opencv.org/4.2.0/d4/db5/structcv_1_1detail_1_1ImageFeatures.html#a7a1bb046a17262f873efd09fa990b327',1,'cv::detail::ImageFeatures']]], + ['imgcodecs_20module_143',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], + ['imgcodecs_2ehpp_144',['imgcodecs.hpp',['https://docs.opencv.org/4.2.0/d7/dd8/imgcodecs_2imgcodecs_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d87/imgcodecs_8hpp.html',1,'(Global Namespace)']]], + ['imghashbase_145',['ImgHashBase',['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1img__hash_1_1ImgHashBase.html',1,'cv::img_hash::ImgHashBase'],['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1img__hash_1_1ImgHashBase.html#acd86138597f1679b8ffb7a730a68761c',1,'cv::img_hash::ImgHashBase::ImgHashBase()']]], + ['imgidx_146',['imgIdx',['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#ab9800c265dcb748a28aa1a2d4b45eea4',1,'cv::DMatch']]], + ['imgname_147',['imgName',['https://docs.opencv.org/4.2.0/d8/d14/structcv_1_1datasets_1_1TR__charsObj.html#aa43d91bb6efa68b2f12df537c7a32338',1,'cv::datasets::TR_charsObj']]], + ['imgproc_20module_148',['Image Processing (imgproc module)',['https://docs.opencv.org/4.2.0/d7/da8/tutorial_table_of_content_imgproc.html',1,'']]], + ['imgproc_2ehpp_149',['imgproc.hpp',['https://docs.opencv.org/4.2.0/dd/d01/imgproc_2include_2opencv2_2imgproc_2imgproc_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d4f/imgproc_2include_2opencv2_2imgproc_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d08/gapi_2include_2opencv2_2gapi_2cpu_2imgproc_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/da0/gapi_2include_2opencv2_2gapi_2fluid_2imgproc_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d8e/gapi_2include_2opencv2_2gapi_2gpu_2imgproc_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d75/gapi_2include_2opencv2_2gapi_2imgproc_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/dca/gapi_2include_2opencv2_2gapi_2ocl_2imgproc_8hpp.html',1,'(Global Namespace)']]], + ['immediate_5frendering_150',['IMMEDIATE_RENDERING',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca0e49c2cab4dc09a7c4b923fcd552142a',1,'cv::viz::IMMEDIATE_RENDERING'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca0e49c2cab4dc09a7c4b923fcd552142a',1,'IMMEDIATE_RENDERING(Global Namespace)']]], + ['imotionstabilizer_151',['IMotionStabilizer',['https://docs.opencv.org/4.2.0/d0/df6/classcv_1_1videostab_1_1IMotionStabilizer.html',1,'cv::videostab']]], + ['impl_152',['IMPL',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a9b77a9e0a5f5e66564a1a39c87903178',1,'cv::instr']]], + ['impl_153',['Impl',['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#a28f9208c375f8929eed44ac72398978b',1,'cv::AsyncPromise::Impl'],['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#aee24c43b9029c5fba6fb8747c948c0da',1,'cv::AsyncArray::Impl'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#aee24c43b9029c5fba6fb8747c948c0da',1,'cv::ocl::Program::Impl'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#aee24c43b9029c5fba6fb8747c948c0da',1,'cv::ocl::ProgramSource::Impl'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#aee24c43b9029c5fba6fb8747c948c0da',1,'cv::ocl::Queue::Impl']]], + ['impl_154',['impl',['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#a4f1f41fd43c10f0fd10e631f5dc60b6c',1,'cv::CommandLineParser::impl'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#ac85bd692412a11f32f2041d7eedbc809',1,'cv::dnn::Model::impl']]], + ['impl_5f_155',['impl_',['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#a9e6b74e94d69e18705e961fe753c45c4',1,'cv::detail::BestOf2NearestMatcher']]], + ['impl_5fipp_156',['IMPL_IPP',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a9b77a9e0a5f5e66564a1a39c87903178a2dae30c2ae75ed684f0d51130fedcf9c',1,'cv::instr']]], + ['impl_5fopencl_157',['IMPL_OPENCL',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a9b77a9e0a5f5e66564a1a39c87903178a28151a2fbfc313cc38dab21d1c878e56',1,'cv::instr']]], + ['impl_5fplain_158',['IMPL_PLAIN',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a9b77a9e0a5f5e66564a1a39c87903178a856b5bd29129dc9ce32254688e2519d4',1,'cv::instr']]], + ['implementation_20classes_159',['Implementation Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01501.html',1,'Base and Implementation Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01497.html',1,'Base and Implementation Classes']]], + ['implementation_20details_160',['Implementation details',['https://docs.opencv.org/4.2.0/d4/ddd/gapi_impl.html',1,'']]], + ['implementation_20helpers_161',['Private implementation helpers',['https://docs.opencv.org/4.2.0/dd/d96/group__core__hal__intrin__impl.html',1,'']]], + ['implementations_20of_20different_20image_20hashing_20algorithms_162',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], + ['implemented_20layers_163',['Partial List of Implemented Layers',['https://docs.opencv.org/4.2.0/d6/d87/group__dnnLayerList.html',1,'']]], + ['implementing_20a_20face_20beautification_20algorithm_20with_20g_20api_164',['Implementing a face beautification algorithm with G-API',['https://docs.opencv.org/4.2.0/d4/d48/tutorial_gapi_face_beautification.html',1,'']]], + ['import_20reconstruction_165',['Import Reconstruction',['https://docs.opencv.org/4.2.0/de/dfd/tutorial_sfm_import_reconstruction.html',1,'']]], + ['importreconstruction_166',['importReconstruction',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ga10a93a70917b83ac7929f7cc40e5365b',1,'cv::sfm::importReconstruction()'],['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ga10a93a70917b83ac7929f7cc40e5365b',1,'importReconstruction(const cv::String &file, OutputArrayOfArrays Rs, OutputArrayOfArrays Ts, OutputArrayOfArrays Ks, OutputArrayOfArrays points3d, int file_format=SFM_IO_BUNDLER)(Global Namespace)']]], + ['improve_20efficiency_167',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], + ['improved_20background_20foreground_20segmentation_20methods_168',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], + ['improvement_20techniques_169',['Performance Measurement and Improvement Techniques',['https://docs.opencv.org/4.2.0/dc/d71/tutorial_py_optimization.html',1,'']]], + ['imread_170',['imread',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga288b8b3da0892bd651fce07b3bbd3a56',1,'cv::imread()'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga288b8b3da0892bd651fce07b3bbd3a56',1,'imread()(Global Namespace)']]], + ['imread_5fanycolor_171',['IMREAD_ANYCOLOR',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80ab6573b69300c092b61800222fe555953',1,'cv::IMREAD_ANYCOLOR'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80ab6573b69300c092b61800222fe555953',1,'IMREAD_ANYCOLOR(Global Namespace)']]], + ['imread_5fanydepth_172',['IMREAD_ANYDEPTH',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a0b486c93c25e8a0b0712681bb7254c18',1,'cv::IMREAD_ANYDEPTH'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a0b486c93c25e8a0b0712681bb7254c18',1,'IMREAD_ANYDEPTH(Global Namespace)']]], + ['imread_5fcolor_173',['IMREAD_COLOR',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80af660544735200cbe942eea09232eb822',1,'cv::IMREAD_COLOR'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80af660544735200cbe942eea09232eb822',1,'IMREAD_COLOR(Global Namespace)']]], + ['imread_5fgrayscale_174',['IMREAD_GRAYSCALE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80ae29981cfc153d3b0cef5c0daeedd2125',1,'cv::IMREAD_GRAYSCALE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80ae29981cfc153d3b0cef5c0daeedd2125',1,'IMREAD_GRAYSCALE(Global Namespace)']]], + ['imread_5fignore_5forientation_175',['IMREAD_IGNORE_ORIENTATION',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a34f91a514cd95127d8ba900840af548e',1,'cv::IMREAD_IGNORE_ORIENTATION'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a34f91a514cd95127d8ba900840af548e',1,'IMREAD_IGNORE_ORIENTATION(Global Namespace)']]], + ['imread_5fload_5fgdal_176',['IMREAD_LOAD_GDAL',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a1b482916f4ffe34f0b90550f267fd896',1,'cv::IMREAD_LOAD_GDAL'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a1b482916f4ffe34f0b90550f267fd896',1,'IMREAD_LOAD_GDAL(Global Namespace)']]], + ['imread_5freduced_5fcolor_5f2_177',['IMREAD_REDUCED_COLOR_2',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a4d3de7230e2682195e09b00728792b37',1,'cv::IMREAD_REDUCED_COLOR_2'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a4d3de7230e2682195e09b00728792b37',1,'IMREAD_REDUCED_COLOR_2(Global Namespace)']]], + ['imread_5freduced_5fcolor_5f4_178',['IMREAD_REDUCED_COLOR_4',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80adf4fbfe43fb7c8c94ca008e7d7d20086',1,'cv::IMREAD_REDUCED_COLOR_4'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80adf4fbfe43fb7c8c94ca008e7d7d20086',1,'IMREAD_REDUCED_COLOR_4(Global Namespace)']]], + ['imread_5freduced_5fcolor_5f8_179',['IMREAD_REDUCED_COLOR_8',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80ac865811dba56b17a8241f9e62c273198',1,'cv::IMREAD_REDUCED_COLOR_8'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80ac865811dba56b17a8241f9e62c273198',1,'IMREAD_REDUCED_COLOR_8(Global Namespace)']]], + ['imread_5freduced_5fgrayscale_5f2_180',['IMREAD_REDUCED_GRAYSCALE_2',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a64063c4e6a917237bd2daef7aa23dc01',1,'cv::IMREAD_REDUCED_GRAYSCALE_2'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a64063c4e6a917237bd2daef7aa23dc01',1,'IMREAD_REDUCED_GRAYSCALE_2(Global Namespace)']]], + ['imread_5freduced_5fgrayscale_5f4_181',['IMREAD_REDUCED_GRAYSCALE_4',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a7903236181de9ade28ba1438b342e6c8',1,'cv::IMREAD_REDUCED_GRAYSCALE_4'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a7903236181de9ade28ba1438b342e6c8',1,'IMREAD_REDUCED_GRAYSCALE_4(Global Namespace)']]], + ['imread_5freduced_5fgrayscale_5f8_182',['IMREAD_REDUCED_GRAYSCALE_8',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a838097893b5d5385d43e6a4470227a33',1,'cv::IMREAD_REDUCED_GRAYSCALE_8'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80a838097893b5d5385d43e6a4470227a33',1,'IMREAD_REDUCED_GRAYSCALE_8(Global Namespace)']]], + ['imread_5funchanged_183',['IMREAD_UNCHANGED',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80aeddd67043ed0df14f9d9a4e66d2b0708',1,'cv::IMREAD_UNCHANGED'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga61d9b0126a3e57d9277ac48327799c80aeddd67043ed0df14f9d9a4e66d2b0708',1,'IMREAD_UNCHANGED(Global Namespace)']]], + ['imreadmodes_184',['ImreadModes',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga61d9b0126a3e57d9277ac48327799c80',1,'cv::ImreadModes'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga61d9b0126a3e57d9277ac48327799c80',1,'ImreadModes(Global Namespace)']]], + ['imreadmulti_185',['imreadmulti',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga4dd47c9ae3d55cc42286cff005825e31',1,'cv::imreadmulti()'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga4dd47c9ae3d55cc42286cff005825e31',1,'imreadmulti()(Global Namespace)']]], + ['imshow_186',['imshow',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga453d42fe4cb60e5723281a89973ee563',1,'cv::imshow(const String &winname, InputArray mat)'],['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html#gaae7e90aa3415c68dba22a5ff2cefc25d',1,'cv::imshow(const String &winname, const ogl::Texture2D &tex)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga1a852143d72014de60067bf3e46faec0',1,'cv::viz::imshow()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga453d42fe4cb60e5723281a89973ee563',1,'imshow(const String &winname, InputArray mat)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html#gaae7e90aa3415c68dba22a5ff2cefc25d',1,'imshow(const String &winname, const ogl::Texture2D &tex)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga1a852143d72014de60067bf3e46faec0',1,'imshow(const String &window_name, InputArray image, const Size &window_size=Size(-1, -1))(Global Namespace)']]], + ['imwrite_187',['imwrite',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gabbc7ef1aa2edfaa87772f1202d67e0ce',1,'cv::imwrite()'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gabbc7ef1aa2edfaa87772f1202d67e0ce',1,'imwrite()(Global Namespace)']]], + ['imwrite_5fexr_5ftype_188',['IMWRITE_EXR_TYPE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca4aed00547168d3a1083a2b1241b99102',1,'cv::IMWRITE_EXR_TYPE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca4aed00547168d3a1083a2b1241b99102',1,'IMWRITE_EXR_TYPE(Global Namespace)']]], + ['imwrite_5fexr_5ftype_5ffloat_189',['IMWRITE_EXR_TYPE_FLOAT',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga47d07d14b3c33151daac7fde6f34e897ad6a009ca0724b2e8bcbe0b60f395f2c7',1,'cv::IMWRITE_EXR_TYPE_FLOAT'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga47d07d14b3c33151daac7fde6f34e897ad6a009ca0724b2e8bcbe0b60f395f2c7',1,'IMWRITE_EXR_TYPE_FLOAT(Global Namespace)']]], + ['imwrite_5fexr_5ftype_5fhalf_190',['IMWRITE_EXR_TYPE_HALF',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga47d07d14b3c33151daac7fde6f34e897a15ef5fdee6e2a55b4d0a1f9b2874fb96',1,'cv::IMWRITE_EXR_TYPE_HALF'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga47d07d14b3c33151daac7fde6f34e897a15ef5fdee6e2a55b4d0a1f9b2874fb96',1,'IMWRITE_EXR_TYPE_HALF(Global Namespace)']]], + ['imwrite_5fjpeg2000_5fcompression_5fx1000_191',['IMWRITE_JPEG2000_COMPRESSION_X1000',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaa082190a50748f712a6384416c2524dd',1,'cv::IMWRITE_JPEG2000_COMPRESSION_X1000'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaa082190a50748f712a6384416c2524dd',1,'IMWRITE_JPEG2000_COMPRESSION_X1000(Global Namespace)']]], + ['imwrite_5fjpeg_5fchroma_5fquality_192',['IMWRITE_JPEG_CHROMA_QUALITY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaaba13094b3575e78a6002788b0ae7354',1,'cv::IMWRITE_JPEG_CHROMA_QUALITY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaaba13094b3575e78a6002788b0ae7354',1,'IMWRITE_JPEG_CHROMA_QUALITY(Global Namespace)']]], + ['imwrite_5fjpeg_5fluma_5fquality_193',['IMWRITE_JPEG_LUMA_QUALITY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca64c65da14d74ab87143d6999c4df12ea',1,'cv::IMWRITE_JPEG_LUMA_QUALITY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca64c65da14d74ab87143d6999c4df12ea',1,'IMWRITE_JPEG_LUMA_QUALITY(Global Namespace)']]], + ['imwrite_5fjpeg_5foptimize_194',['IMWRITE_JPEG_OPTIMIZE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acae80c3e72393ec86b8ea1db4a2a228b5f',1,'cv::IMWRITE_JPEG_OPTIMIZE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acae80c3e72393ec86b8ea1db4a2a228b5f',1,'IMWRITE_JPEG_OPTIMIZE(Global Namespace)']]], + ['imwrite_5fjpeg_5fprogressive_195',['IMWRITE_JPEG_PROGRESSIVE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca32ab52a075fc4e2ca23760a80b3fcd12',1,'cv::IMWRITE_JPEG_PROGRESSIVE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca32ab52a075fc4e2ca23760a80b3fcd12',1,'IMWRITE_JPEG_PROGRESSIVE(Global Namespace)']]], + ['imwrite_5fjpeg_5fquality_196',['IMWRITE_JPEG_QUALITY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca947af22db2cf6f1f482289b0985b09ec',1,'cv::IMWRITE_JPEG_QUALITY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca947af22db2cf6f1f482289b0985b09ec',1,'IMWRITE_JPEG_QUALITY(Global Namespace)']]], + ['imwrite_5fjpeg_5frst_5finterval_197',['IMWRITE_JPEG_RST_INTERVAL',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca06f325a56b6b09074d9781de18745560',1,'cv::IMWRITE_JPEG_RST_INTERVAL'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca06f325a56b6b09074d9781de18745560',1,'IMWRITE_JPEG_RST_INTERVAL(Global Namespace)']]], + ['imwrite_5fpam_5fformat_5fblackandwhite_198',['IMWRITE_PAM_FORMAT_BLACKANDWHITE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a32a5eb9e6aa378ef126a6ec29c710d15',1,'cv::IMWRITE_PAM_FORMAT_BLACKANDWHITE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a32a5eb9e6aa378ef126a6ec29c710d15',1,'IMWRITE_PAM_FORMAT_BLACKANDWHITE(Global Namespace)']]], + ['imwrite_5fpam_5fformat_5fgrayscale_199',['IMWRITE_PAM_FORMAT_GRAYSCALE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a9f2122f919b87bd6f5209ebe3673478d',1,'cv::IMWRITE_PAM_FORMAT_GRAYSCALE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a9f2122f919b87bd6f5209ebe3673478d',1,'IMWRITE_PAM_FORMAT_GRAYSCALE(Global Namespace)']]], + ['imwrite_5fpam_5fformat_5fgrayscale_5falpha_200',['IMWRITE_PAM_FORMAT_GRAYSCALE_ALPHA',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a31754d8e503b394996982d8eeb5916b5',1,'cv::IMWRITE_PAM_FORMAT_GRAYSCALE_ALPHA'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a31754d8e503b394996982d8eeb5916b5',1,'IMWRITE_PAM_FORMAT_GRAYSCALE_ALPHA(Global Namespace)']]], + ['imwrite_5fpam_5fformat_5fnull_201',['IMWRITE_PAM_FORMAT_NULL',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a05708faa19fda2b0e3e793542fced3c9',1,'cv::IMWRITE_PAM_FORMAT_NULL'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a05708faa19fda2b0e3e793542fced3c9',1,'IMWRITE_PAM_FORMAT_NULL(Global Namespace)']]], + ['imwrite_5fpam_5fformat_5frgb_202',['IMWRITE_PAM_FORMAT_RGB',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a749f4c5db48aa048ae4dbd8670d7d58d',1,'cv::IMWRITE_PAM_FORMAT_RGB'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01a749f4c5db48aa048ae4dbd8670d7d58d',1,'IMWRITE_PAM_FORMAT_RGB(Global Namespace)']]], + ['imwrite_5fpam_5fformat_5frgb_5falpha_203',['IMWRITE_PAM_FORMAT_RGB_ALPHA',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01adfdc63fecaa2abcbe1d98b79030c726a',1,'cv::IMWRITE_PAM_FORMAT_RGB_ALPHA'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga4e6c77a906952525a4d22fb3efea0e01adfdc63fecaa2abcbe1d98b79030c726a',1,'IMWRITE_PAM_FORMAT_RGB_ALPHA(Global Namespace)']]], + ['imwrite_5fpam_5ftupletype_204',['IMWRITE_PAM_TUPLETYPE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acacc7bb2ed1314ec9278a38d85e83b6623',1,'cv::IMWRITE_PAM_TUPLETYPE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acacc7bb2ed1314ec9278a38d85e83b6623',1,'IMWRITE_PAM_TUPLETYPE(Global Namespace)']]], + ['imwrite_5fpng_5fbilevel_205',['IMWRITE_PNG_BILEVEL',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca8c609ad94b7bd036ef68c51e7f77915f',1,'cv::IMWRITE_PNG_BILEVEL'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca8c609ad94b7bd036ef68c51e7f77915f',1,'IMWRITE_PNG_BILEVEL(Global Namespace)']]], + ['imwrite_5fpng_5fcompression_206',['IMWRITE_PNG_COMPRESSION',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acad2548321c69ab9c0582fd51e75ace1d0',1,'cv::IMWRITE_PNG_COMPRESSION'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acad2548321c69ab9c0582fd51e75ace1d0',1,'IMWRITE_PNG_COMPRESSION(Global Namespace)']]], + ['imwrite_5fpng_5fstrategy_207',['IMWRITE_PNG_STRATEGY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaa95faec46150b372c80c7d4bbedbcf8a',1,'cv::IMWRITE_PNG_STRATEGY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaa95faec46150b372c80c7d4bbedbcf8a',1,'IMWRITE_PNG_STRATEGY(Global Namespace)']]], + ['imwrite_5fpng_5fstrategy_5fdefault_208',['IMWRITE_PNG_STRATEGY_DEFAULT',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a5bb296ccb3fab45a113a1cc28bf43abf',1,'cv::IMWRITE_PNG_STRATEGY_DEFAULT'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a5bb296ccb3fab45a113a1cc28bf43abf',1,'IMWRITE_PNG_STRATEGY_DEFAULT(Global Namespace)']]], + ['imwrite_5fpng_5fstrategy_5ffiltered_209',['IMWRITE_PNG_STRATEGY_FILTERED',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a3def1a542d499f4f05c19efab9d79292',1,'cv::IMWRITE_PNG_STRATEGY_FILTERED'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a3def1a542d499f4f05c19efab9d79292',1,'IMWRITE_PNG_STRATEGY_FILTERED(Global Namespace)']]], + ['imwrite_5fpng_5fstrategy_5ffixed_210',['IMWRITE_PNG_STRATEGY_FIXED',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a4663acb92a49bb13104a2769cee7d0c8',1,'cv::IMWRITE_PNG_STRATEGY_FIXED'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a4663acb92a49bb13104a2769cee7d0c8',1,'IMWRITE_PNG_STRATEGY_FIXED(Global Namespace)']]], + ['imwrite_5fpng_5fstrategy_5fhuffman_5fonly_211',['IMWRITE_PNG_STRATEGY_HUFFMAN_ONLY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9affed3ef30c9147769361546cf0b5ad5a',1,'cv::IMWRITE_PNG_STRATEGY_HUFFMAN_ONLY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9affed3ef30c9147769361546cf0b5ad5a',1,'IMWRITE_PNG_STRATEGY_HUFFMAN_ONLY(Global Namespace)']]], + ['imwrite_5fpng_5fstrategy_5frle_212',['IMWRITE_PNG_STRATEGY_RLE',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a5d75e74ce7cdaf0139f1d44d23734b43',1,'cv::IMWRITE_PNG_STRATEGY_RLE'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ggaa60044d347ffd187161b5ec9ea2ef2f9a5d75e74ce7cdaf0139f1d44d23734b43',1,'IMWRITE_PNG_STRATEGY_RLE(Global Namespace)']]], + ['imwrite_5fpxm_5fbinary_213',['IMWRITE_PXM_BINARY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca6ad01adc2675d735ec8424e6e7562087',1,'cv::IMWRITE_PXM_BINARY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca6ad01adc2675d735ec8424e6e7562087',1,'IMWRITE_PXM_BINARY(Global Namespace)']]], + ['imwrite_5ftiff_5fcompression_214',['IMWRITE_TIFF_COMPRESSION',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acad3d5dac0cfc770b96fc61e895a165fa4',1,'cv::IMWRITE_TIFF_COMPRESSION'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acad3d5dac0cfc770b96fc61e895a165fa4',1,'IMWRITE_TIFF_COMPRESSION(Global Namespace)']]], + ['imwrite_5ftiff_5fresunit_215',['IMWRITE_TIFF_RESUNIT',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaac188d2ba4ccffdda3d820c8e9dfa7c0',1,'cv::IMWRITE_TIFF_RESUNIT'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42acaac188d2ba4ccffdda3d820c8e9dfa7c0',1,'IMWRITE_TIFF_RESUNIT(Global Namespace)']]], + ['imwrite_5ftiff_5fxdpi_216',['IMWRITE_TIFF_XDPI',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca59a88cc19c00988a6677c60e5f6b03d0',1,'cv::IMWRITE_TIFF_XDPI'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca59a88cc19c00988a6677c60e5f6b03d0',1,'IMWRITE_TIFF_XDPI(Global Namespace)']]], + ['imwrite_5ftiff_5fydpi_217',['IMWRITE_TIFF_YDPI',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca76b632839a9f3e542e90fa7bfcfd8b9a',1,'cv::IMWRITE_TIFF_YDPI'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca76b632839a9f3e542e90fa7bfcfd8b9a',1,'IMWRITE_TIFF_YDPI(Global Namespace)']]], + ['imwrite_5fwebp_5fquality_218',['IMWRITE_WEBP_QUALITY',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca7d3f848cc45d3138de0a2053d213a54a',1,'cv::IMWRITE_WEBP_QUALITY'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gga292d81be8d76901bff7988d18d2b42aca7d3f848cc45d3138de0a2053d213a54a',1,'IMWRITE_WEBP_QUALITY(Global Namespace)']]], + ['imwriteexrtypeflags_219',['ImwriteEXRTypeFlags',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga47d07d14b3c33151daac7fde6f34e897',1,'cv::ImwriteEXRTypeFlags'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga47d07d14b3c33151daac7fde6f34e897',1,'ImwriteEXRTypeFlags(Global Namespace)']]], + ['imwriteflags_220',['ImwriteFlags',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga292d81be8d76901bff7988d18d2b42ac',1,'cv::ImwriteFlags'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga292d81be8d76901bff7988d18d2b42ac',1,'ImwriteFlags(Global Namespace)']]], + ['imwritepamflags_221',['ImwritePAMFlags',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga4e6c77a906952525a4d22fb3efea0e01',1,'cv::ImwritePAMFlags'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#ga4e6c77a906952525a4d22fb3efea0e01',1,'ImwritePAMFlags(Global Namespace)']]], + ['imwritepngflags_222',['ImwritePNGFlags',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gaa60044d347ffd187161b5ec9ea2ef2f9',1,'cv::ImwritePNGFlags'],['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html#gaa60044d347ffd187161b5ec9ea2ef2f9',1,'ImwritePNGFlags(Global Namespace)']]], + ['in_223',['In',['https://docs.opencv.org/4.2.0/dd/d98/structcv_1_1gapi_1_1ie_1_1PortCfg.html#ad9c639e74f1c6a4c9ef143e730f70478',1,'cv::gapi::ie::PortCfg']]], + ['in_224',['in',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'basic_ios< char, _Traits >::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'basic_iostream< char >::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'basic_istream< char >::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'basic_istream< char, _Traits >::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'basic_ostream< char >::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'basic_ostream< char, _Traits >::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_fstream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_ifstream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_ios::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_iostream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_istream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_istringstream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_ofstream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_ostream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_ostringstream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::basic_stringstream::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a652e2323949eea3d906e1c81bd8ce8f7',1,'std::ios_base::in'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'__codecvt_abstract_base< _InternT, _ExternT, encoding_state >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'__codecvt_abstract_base< char, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'__codecvt_abstract_base< char16_t, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'__codecvt_abstract_base< char32_t, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'__codecvt_abstract_base< wchar_t, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'codecvt< _Elem, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::__codecvt_abstract_base::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt< _InternT, _ExternT, encoding_state >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt< char, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt< char16_t, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt< char32_t, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt< wchar_t, char, mbstate_t >::in()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a38117d39e9725f52735f51f4f4b72354',1,'std::codecvt_byname::in()']]], + ['in_20a_20video_225',['Face landmark detection in a video',['https://docs.opencv.org/4.2.0/d8/d3c/tutorial_face_landmark_detection_in_video.html',1,'']]], + ['in_20an_20image_226',['Face landmark detection in an image',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'']]], + ['in_20android_20camera_20preview_20based_20cv_20application_227',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], + ['in_20browser_228',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], + ['in_20c_229',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], + ['in_20cmake_20projects_230',['Using Eigen in CMake Projects',['https://eigen.tuxfamily.org/dox/TopicCMakeGuide.html',1,'']]], + ['in_20cuda_20kernels_231',['Using Eigen in CUDA kernels',['https://eigen.tuxfamily.org/dox/TopicCUDA.html',1,'']]], + ['in_20eigen_232',['Expression templates in Eigen',['https://eigen.tuxfamily.org/dox/TopicEigenExpressionTemplates.html',1,'']]], + ['in_20fedora_233',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], + ['in_20ios_234',['Installation in iOS',['https://docs.opencv.org/4.2.0/d5/da3/tutorial_ios_install.html',1,'']]], + ['in_20linux_235',['Installation in Linux',['https://docs.opencv.org/4.2.0/d7/d9f/tutorial_linux_install.html',1,'']]], + ['in_20macos_236',['Installation in MacOS',['https://docs.opencv.org/4.2.0/d0/db2/tutorial_macos_install.html',1,'']]], + ['in_20memory_20images_20in_20the_20visual_20studio_20debugger_237',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['in_20multi_20dimensional_20spaces_238',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], + ['in_20node_20js_239',['Using OpenCV.js In Node.js',['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'']]], + ['in_20opencv_240',['in OpenCV',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html',1,'ColorMaps in OpenCV'],['https://docs.opencv.org/4.2.0/d3/d05/tutorial_py_table_of_contents_contours.html',1,'Contours in OpenCV'],['https://docs.opencv.org/4.2.0/dc/da5/tutorial_py_drawing_functions.html',1,'Drawing Functions in OpenCV'],['https://docs.opencv.org/4.2.0/dc/d4d/tutorial_py_table_of_contents_gui.html',1,'Gui Features in OpenCV'],['https://docs.opencv.org/4.2.0/de/db2/tutorial_py_table_of_contents_histograms.html',1,'Histograms in OpenCV'],['https://docs.opencv.org/4.2.0/d2/d96/tutorial_py_table_of_contents_imgproc.html',1,'Image Processing in OpenCV'],['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'Image Transforms in OpenCV'],['https://docs.opencv.org/4.2.0/d1/d5c/tutorial_py_kmeans_opencv.html',1,'K-Means Clustering in OpenCV']]], + ['in_20opencv_20js_241',['in OpenCV js',['https://docs.opencv.org/4.2.0/d0/d43/tutorial_js_table_of_contents_contours.html',1,'Contours in OpenCV.js'],['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'Histograms in OpenCV.js'],['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'Image Transforms in OpenCV.js']]], + ['in_20subpixels_242',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], + ['in_20the_20visual_20studio_20debugger_243',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['in_20ubuntu_244',['Install OpenCV-Python in Ubuntu',['https://docs.opencv.org/4.2.0/d2/de6/tutorial_py_setup_in_ubuntu.html',1,'']]], + ['in_20video_20capture_245',['Face Detection in Video Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'']]], + ['in_20windows_246',['in Windows',['https://docs.opencv.org/4.2.0/d5/de5/tutorial_py_setup_in_windows.html',1,'Install OpenCV-Python in Windows'],['https://docs.opencv.org/4.2.0/d3/d52/tutorial_windows_install.html',1,'Installation in Windows']]], + ['in_20your_20image_247',['Finding contours in your image',['https://docs.opencv.org/4.2.0/df/d0d/tutorial_find_contours.html',1,'']]], + ['in_5favail_248',['in_avail',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'__gnu_cxx::enc_filebuf::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'__gnu_cxx::stdio_filebuf::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'__gnu_cxx::stdio_sync_filebuf::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'basic_filebuf< char_type, traits_type >::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'basic_streambuf< _Elem, _Tr >::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'basic_streambuf< char, _Traits >::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'basic_streambuf< char, char_traits< char > >::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'std::basic_filebuf::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'std::basic_streambuf::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'std::basic_stringbuf::in_avail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a924a684fe2a6844d766e25f4051b705c',1,'std::wbuffer_convert::in_avail()']]], + ['in_5fplace_249',['in_place',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html#ga69b3880c858acc1b7f88478d209b2fb3',1,]]], + ['in_5fplace_5ft_250',['in_place_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10075.html',1,'std::experimental::fundamentals_v1']]], + ['in_5ftag_251',['In_Tag',['https://docs.opencv.org/4.2.0/d0/dde/structcv_1_1In__Tag.html',1,'cv']]], + ['inarg_252',['inArg',['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1detail_1_1GCompoundContext.html#ada1625c10da81a26710a2a56ce8e4c9a',1,'cv::detail::GCompoundContext::inArg()'],['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#adfe05f64a47014aed5e2569fb9b01f96',1,'cv::GCPUContext::inArg()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a3dc8d9a90a8aa11096b7624a739ee8b8',1,'cv::GOCLContext::inArg()'],['https://docs.opencv.org/4.2.0/de/d5f/structcv_1_1GPlaidMLContext.html#a23fcdd9022a11fd08605e4c0262dccac',1,'cv::GPlaidMLContext::inArg()']]], + ['inargs_253',['InArgs',['https://docs.opencv.org/4.2.0/df/d7c/classcv_1_1GKernelType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a7215cc7c28a5d1d3d20397e3bcba6675',1,'cv::GKernelType< K, std::function< R(Args...)> >::InArgs'],['https://docs.opencv.org/4.2.0/dc/d2d/classcv_1_1GKernelTypeM_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a2839de0a0c028b1112bc115e67b08e23',1,'cv::GKernelTypeM< K, std::function< std::tuple< R... >(Args...)> >::InArgs'],['https://docs.opencv.org/4.2.0/dc/de8/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a4e620f80b7c2260381689f2917c3dc9d',1,'cv::GNetworkType< K, std::function< R(Args...)> >::InArgs'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a3713cb5a0d98f023b092dbff23be9766',1,'cv::GNetworkType< K, std::function< std::tuple< R... >(Args...)> >::InArgs']]], + ['include_254',['include',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#acd1c2ad5bf8bf27f0b61ae858da370bd',1,'cv::gapi::GKernelPackage']]], + ['includes_255',['includes',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#aeb06af2712efd64912a5fa1a42837f8f',1,'cv::gapi::GKernelPackage::includes()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga67c9386f01daa7763952b9096ab94c96',1,'std::includes(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#gaeffeb80fabc63883a4d5e907ca922913',1,'std::includes(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga67c9386f01daa7763952b9096ab94c96',1,'includes(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#gaeffeb80fabc63883a4d5e907ca922913',1,'includes(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _Compare __comp)(Global Namespace)']]], + ['includesapi_256',['includesAPI',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#aa2fd0bdce5a1e84888077349ef261908',1,'cv::gapi::GKernelPackage']]], + ['incompletecholesky_257',['IncompleteCholesky',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html',1,'Eigen::IncompleteCholesky< class, _UpLo, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#adaaa3975b8cf53f910d6a3344af92379',1,'Eigen::IncompleteCholesky::IncompleteCholesky()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a757499fc814988a5b112b1f34d0295e1',1,'Eigen::IncompleteCholesky::IncompleteCholesky(const MatrixType &matrix)']]], + ['incompletelut_258',['IncompleteLUT',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteLUT.html',1,'Eigen']]], + ['increment_259',['increment',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#ad2d0da3af999df8d7992143640f344a6',1,'std::linear_congruential_engine']]], + ['incvmemallocator_260',['INCVMemAllocator',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html',1,'']]], + ['ind1_261',['ind1',['https://docs.opencv.org/4.2.0/db/d26/structcv_1_1face_1_1FacemarkAAM_1_1Model_1_1Texture.html#aa231d8739097f2aeb0df0ab2de2bfd0e',1,'cv::face::FacemarkAAM::Model::Texture']]], + ['ind2_262',['ind2',['https://docs.opencv.org/4.2.0/db/d26/structcv_1_1face_1_1FacemarkAAM_1_1Model_1_1Texture.html#a350bda90f3aba032c2b0ae5f02ce6238',1,'cv::face::FacemarkAAM::Model::Texture']]], + ['independent_20elementary_20features_263',['BRIEF (Binary Robust Independent Elementary Features)',['https://docs.opencv.org/4.2.0/dc/d7d/tutorial_py_brief.html',1,'']]], + ['independent_5fbits_5fengine_264',['independent_bits_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html',1,'std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#ac39fb77deb769d85123ece7b6c981c8f',1,'std::independent_bits_engine::independent_bits_engine()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a4d92ca47578567e9465b90b6461acb39',1,'std::independent_bits_engine::independent_bits_engine(const _RandomNumberEngine &__rng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#ae6b9f2ddf321e24e8bae7edd6f4c2e7d',1,'std::independent_bits_engine::independent_bits_engine(_RandomNumberEngine &&__rng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#ad54d8549b7e6e4f9908486383d543efa',1,'std::independent_bits_engine::independent_bits_engine(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a1b27f8236f8a90380ea7fab8a3014d90',1,'std::independent_bits_engine::independent_bits_engine(_Sseq &__q)']]], + ['index_265',['Index',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a774ef355da13d6bee6a6e7244c15231a',1,'Eigen::AlignedBox::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#abc0218d8b902af0d6c759bfc0a8a8d74',1,'Eigen::ComplexEigenSolver::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a652104d13723a5b1db2937866a034557',1,'Eigen::ComplexSchur::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a652104d13723a5b1db2937866a034557',1,'ComplexSchur< MatrixType >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'Eigen::EigenBase::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< FullPivLU< _MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< HouseholderQR< _MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< Inverse< PermutationType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< LLT< _MatrixType, _UpLo > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< PartialPivLU< _MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< PermutationWrapper< _IndicesType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SVDBase< Derived > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< Transpose< MatrixType > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::Index'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a554f30542cc2316add4b1ea0a492ff02',1,'EigenBase< TriangularView< MatrixType, Mode > >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a5bff6a6bc0efac67d52c60c2c3deb9ee',1,'Eigen::EigenSolver::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#a46a0ff3841059479ec314e56a5645302',1,'Eigen::GeneralizedEigenSolver::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a8e287ac222f53e2c8ce82faa43e95ac6',1,'Eigen::HessenbergDecomposition::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a8e287ac222f53e2c8ce82faa43e95ac6',1,'HessenbergDecomposition< MatrixType >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a58d2307d16128a0026021374e9e10465',1,'Eigen::Hyperplane::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a3c9f84dd8608940282b16652a296c764',1,'Eigen::ParametrizedLine::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a6201e534e901b5f4e66f72c176b534a3',1,'Eigen::RealQZ::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a6201e534e901b5f4e66f72c176b534a3',1,'RealQZ< MatrixType >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a8bd4653e2d9569a44ecc95e746422d3f',1,'Eigen::RealSchur::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a8bd4653e2d9569a44ecc95e746422d3f',1,'RealSchur< MatrixType >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a8a59ab7734b6eae2754fd78bc7c3a360',1,'Eigen::SelfAdjointEigenSolver::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a96c2dfb0ce43fd8e19adcdf6094f5f63',1,'Eigen::Stride::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a96c2dfb0ce43fd8e19adcdf6094f5f63',1,'Stride< 0, Value >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a96c2dfb0ce43fd8e19adcdf6094f5f63',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a96c2dfb0ce43fd8e19adcdf6094f5f63',1,'Stride< Value, 0 >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a6229a37997eca1072b52cca5ee7a2bec',1,'Eigen::SVDBase::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a6229a37997eca1072b52cca5ee7a2bec',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a49df3689ac2b736bcb564dec47d6486c',1,'Eigen::Transform::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a7bd1f9fccec1e93b77a2214b2d30aae9',1,'Eigen::Tridiagonalization::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'Eigen::VectorwiseOp::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const Derived, Horizontal >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const Derived, Vertical >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::Index'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4907c654e5810edd98e4162093b19532',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::Index'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a62e77e0933482dafde8fe197d9a2cfde',1,'Eigen::Index']]], + ['index_266',['index',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a6e86a7a617c062c8e36c3e991fa3fc1c',1,'cv::util::variant::index()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a6e86a7a617c062c8e36c3e991fa3fc1c',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::index()'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga82775e152f8a74c5fe06f5a7343e0233a9dfc90ef6dc3ba62850d76cc3534572c',1,'cv::datasets::index'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga82775e152f8a74c5fe06f5a7343e0233a9dfc90ef6dc3ba62850d76cc3534572c',1,'index(Global Namespace)']]], + ['index_5fof_267',['index_of',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#aa87645829693267bb0f0ecd5325a1fc7',1,'cv::util::variant::index_of()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#aa87645829693267bb0f0ecd5325a1fc7',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::index_of()']]], + ['index_5fsequence_268',['index_sequence',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acdfada06a9fb47abbf52c264b95e689e',1,'std']]], + ['index_5fsequence_5ffor_269',['index_sequence_for',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af540abd32f95a08e48ea6ca00a5a8ad3',1,'std']]], + ['index_5ftesting_2eh_270',['index_testing.h',['https://docs.opencv.org/4.2.0/db/dd9/index__testing_8h.html',1,'']]], + ['index_5ftype_271',['index_type',['https://docs.opencv.org/4.2.0/d0/d2a/structcv_1_1cudev_1_1AffineMapPtr.html#a52baed9ba6f948c8f7192d85fb3eb40f',1,'cv::cudev::AffineMapPtr::index_type'],['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#a0bdd1eec197cb450b6686d9446a13266',1,'cv::cudev::BinaryTransformPtr::index_type'],['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#a0616b2b0e5a3ce7414145c814587c450',1,'cv::cudev::BrdBase::index_type'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#a1100a33c7f274feb2bd7e429f79c385b',1,'cv::cudev::BrdConstant::index_type'],['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#ad8e2789fa7f25353cba39526ecbc7365',1,'cv::cudev::CommonAreaInterPtr::index_type'],['https://docs.opencv.org/4.2.0/d5/db7/structcv_1_1cudev_1_1ConstantPtr.html#afb3346bf66085990c971571f0612b11e',1,'cv::cudev::ConstantPtr::index_type'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1CubicInterPtr.html#ae192c2869b7e71065042816f3c4a03b8',1,'cv::cudev::CubicInterPtr::index_type'],['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1cudev_1_1DerivXPtr.html#a8a6529e58144169e05302134f8f99ea3',1,'cv::cudev::DerivXPtr::index_type'],['https://docs.opencv.org/4.2.0/dc/d51/structcv_1_1cudev_1_1DerivYPtr.html#ae2c972cf881553226cc8ad67edfcd968',1,'cv::cudev::DerivYPtr::index_type'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#ae82f92236ad754a0536d05d3b00aebaf',1,'cv::cudev::GlobPtr::index_type'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#a79490d776322b5e52d52887189e3a04f',1,'cv::cudev::IntegerAreaInterPtr::index_type'],['https://docs.opencv.org/4.2.0/d0/de6/structcv_1_1cudev_1_1LaplacianPtr_3_011_00_01SrcPtr_01_4.html#a88eb6eeba437a94c7fe38938254e67f3',1,'cv::cudev::LaplacianPtr< 1, SrcPtr >::index_type'],['https://docs.opencv.org/4.2.0/d4/d89/structcv_1_1cudev_1_1LaplacianPtr_3_013_00_01SrcPtr_01_4.html#a1d2bceaadc82fb32c2c7c91a694370ab',1,'cv::cudev::LaplacianPtr< 3, SrcPtr >::index_type'],['https://docs.opencv.org/4.2.0/d7/d8a/structcv_1_1cudev_1_1LinearInterPtr.html#a1f415bf0b9d4a4f2bb8b8bfe43494e16',1,'cv::cudev::LinearInterPtr::index_type'],['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html#a0409c343dbf9496efa21aa1b3a5ad170',1,'cv::cudev::LutPtr::index_type'],['https://docs.opencv.org/4.2.0/d0/df5/structcv_1_1cudev_1_1NearestInterPtr.html#a4eab6aaed5972a20a156bc805e47fe66',1,'cv::cudev::NearestInterPtr::index_type'],['https://docs.opencv.org/4.2.0/df/d20/structcv_1_1cudev_1_1PerspectiveMapPtr.html#aeac29e6301d93225405fdcdb8a2bf966',1,'cv::cudev::PerspectiveMapPtr::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'cv::cudev::PtrTraitsBase::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< AffineMapPtrSz, AffineMapPtr >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op >, BinaryTransformPtr< Src1Ptr, Src2Ptr, Op > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< CommonAreaInterPtrSz< SrcPtr >, CommonAreaInterPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< ConstantPtrSz< T >, ConstantPtr< T > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< CubicInterPtrSz< SrcPtr >, CubicInterPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< DerivXPtrSz< SrcPtr >, DerivXPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< DerivYPtrSz< SrcPtr >, DerivYPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< GlobPtrSz< T >, GlobPtr< T > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< GpuMat_< T >, GlobPtr< T > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< IntegerAreaInterPtrSz< SrcPtr >, IntegerAreaInterPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< LaplacianPtrSz< ksize, SrcPtr >, LaplacianPtr< ksize, SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< LinearInterPtrSz< SrcPtr >, LinearInterPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< LutPtrSz< SrcPtr, TablePtr >, LutPtr< SrcPtr, TablePtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< NearestInterPtrSz< SrcPtr >, NearestInterPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< PerspectiveMapPtrSz, PerspectiveMapPtr >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< Ptr2DSz, Ptr2DSz >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< RemapPtr1Sz< SrcPtr, MapPtr >, RemapPtr1< SrcPtr, MapPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr >, RemapPtr2< SrcPtr, MapXPtr, MapYPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< ResizePtrSz< SrcPtr >, ResizePtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< ScharrXPtrSz< SrcPtr >, ScharrXPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< ScharrYPtrSz< SrcPtr >, ScharrYPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< SingleMaskChannelsSz< MaskPtr >, SingleMaskChannels< MaskPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< SobelXPtrSz< SrcPtr >, SobelXPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< SobelYPtrSz< SrcPtr >, SobelYPtr< SrcPtr > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< SrcPtr, SrcPtr >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< Texture< T >, TexturePtr< T > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< UnaryTransformPtrSz< SrcPtr, Op >, UnaryTransformPtr< SrcPtr, Op > >::index_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a1ef908b04f9c735729f566d7dad3f07a',1,'PtrTraitsBase< ZipPtrSz< PtrTuple >, ZipPtr< PtrTuple > >::index_type'],['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html#a93fb128c29bc8b76bcd6ad3a64418b32',1,'cv::cudev::RemapPtr1::index_type'],['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#a35f9b626f26772c62ff27b187b9e38aa',1,'cv::cudev::RemapPtr2::index_type'],['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#aebd016a3f088f40525b0e633aa4c87ab',1,'cv::cudev::ResizePtr::index_type'],['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1ScharrXPtr.html#aa3182f8d3fd3a0cd65471fc1d782c9fd',1,'cv::cudev::ScharrXPtr::index_type'],['https://docs.opencv.org/4.2.0/d0/d70/structcv_1_1cudev_1_1ScharrYPtr.html#a49fe3fe3aa0ea551fff971781ad6b7ee',1,'cv::cudev::ScharrYPtr::index_type'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#a0f94a551bd9ff52f29577f222a8e6136',1,'cv::cudev::SingleMaskChannels::index_type'],['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1SobelXPtr.html#a46ed3a67cfa9e549dd435a19ecac1192',1,'cv::cudev::SobelXPtr::index_type'],['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1SobelYPtr.html#a18f6a5514170a42e4bfaf226903f3055',1,'cv::cudev::SobelYPtr::index_type'],['https://docs.opencv.org/4.2.0/d2/d09/structcv_1_1cudev_1_1TexturePtr.html#ae3381236f733dd74cdad90d015033c63',1,'cv::cudev::TexturePtr::index_type'],['https://docs.opencv.org/4.2.0/dd/d01/structcv_1_1cudev_1_1UnaryTransformPtr.html#ae3cf5bd15f570325ccfbeb3a54baf59e',1,'cv::cudev::UnaryTransformPtr::index_type'],['https://docs.opencv.org/4.2.0/da/d2c/structcv_1_1cudev_1_1WithOutMask.html#a8aae96956a3c84d9e88fee0594712a51',1,'cv::cudev::WithOutMask::index_type'],['https://docs.opencv.org/4.2.0/dd/de4/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_01_4_01_4.html#a820cd1f65049b4c916ab0e6e67b9f9c3',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1 > >::index_type'],['https://docs.opencv.org/4.2.0/d4/dff/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_01_4_01_4.html#a99060d65ba9a309ad4eadc7c2ee00798',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2 > >::index_type'],['https://docs.opencv.org/4.2.0/dd/d2b/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_00_01Ptr3_01_4_01_4.html#afe116ee4f760f37fb1069325c6bbfb32',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2, Ptr3 > >::index_type']]], + ['indexedview_272',['IndexedView',['https://eigen.tuxfamily.org/dox/classEigen_1_1IndexedView.html',1,'Eigen']]], + ['indexing_273',['Slicing and Indexing',['https://eigen.tuxfamily.org/dox/group__TutorialSlicingIndexing.html',1,'']]], + ['indexparams_274',['indexParams',['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#af2b50fb9c749ff4e14902192326247ad',1,'cv::FlannBasedMatcher']]], + ['indexpcflann_275',['indexPCFlann',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gadca01b67adab0bbbdd5b2507f63c7f21',1,'cv::ppf_match_3d::indexPCFlann()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gadca01b67adab0bbbdd5b2507f63c7f21',1,'indexPCFlann()(Global Namespace)']]], + ['indication_5ft_276',['indication_t',['../namespacerobot_1_1types.html#a2ed6fa6081a4897f2e496d80b140775f',1,'robot::types']]], + ['indices_277',['indices',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a16fa3afafdf703399d62c80f950802f1',1,'Eigen::PermutationBase::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adec727546b6882ecaa57e76d084951c5',1,'Eigen::PermutationBase::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a16fa3afafdf703399d62c80f950802f1',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adec727546b6882ecaa57e76d084951c5',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a16fa3afafdf703399d62c80f950802f1',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adec727546b6882ecaa57e76d084951c5',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a16fa3afafdf703399d62c80f950802f1',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adec727546b6882ecaa57e76d084951c5',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a16fa3afafdf703399d62c80f950802f1',1,'PermutationBase< PermutationWrapper< _IndicesType > >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adec727546b6882ecaa57e76d084951c5',1,'PermutationBase< PermutationWrapper< _IndicesType > >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#ac089ead468a58d75f276ad2b253578c0',1,'Eigen::PermutationMatrix::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a2f1ab379207fcd1ceb33941e25cf50c2',1,'Eigen::PermutationMatrix::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#ac089ead468a58d75f276ad2b253578c0',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a2f1ab379207fcd1ceb33941e25cf50c2',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#ac089ead468a58d75f276ad2b253578c0',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a2f1ab379207fcd1ceb33941e25cf50c2',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#ac089ead468a58d75f276ad2b253578c0',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a2f1ab379207fcd1ceb33941e25cf50c2',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationWrapper.html#a88ae93cc14c136b2eec4a286b4c10c34',1,'Eigen::PermutationWrapper::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a678dfbd513871473bcd36bbc453eed8c',1,'Eigen::Transpositions::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a786fd676c156124025aaf446d811d14f',1,'Eigen::Transpositions::indices() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a678dfbd513871473bcd36bbc453eed8c',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::indices()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a786fd676c156124025aaf446d811d14f',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::indices() const']]], + ['indigo_278',['indigo',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a8fe4df9b2018005398ab65df2bd400f1',1,'cv::viz::Color']]], + ['indirect_5farray_279',['indirect_array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04663.html',1,'std::indirect_array< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad5e982b5f515ce67d9e6b55c84a61cb2',1,'std::indirect_array::indirect_array()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad5e982b5f515ce67d9e6b55c84a61cb2',1,'indirect_array(const indirect_array &)(Global Namespace)']]], + ['indirect_5farray_2eh_280',['indirect_array.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00380.html',1,'']]], + ['inf_281',['inf',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadd37b1cc59a301a3e1b269ade244712c',1,'cv::softdouble::inf()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga15b1c64547f8da94c0c6e0c21e5cc568',1,'cv::softfloat::inf()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga15b1c64547f8da94c0c6e0c21e5cc568',1,'inf()(Global Namespace)']]], + ['infer_282',['infer',['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#a90d6679e32f4bdfabe3a990d06c02876',1,'cv::gapi::infer(cv::GArray< cv::Rect > roi, Args &&... args)'],['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#ad56fa2785be315ddc82a800878123a58',1,'cv::gapi::infer(Args &&... args)']]], + ['infer_2ehpp_283',['infer.hpp',['https://docs.opencv.org/4.2.0/d6/d32/infer_8hpp.html',1,'']]], + ['inferbbox_284',['InferBbox',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html',1,'cv::dnn_objdetect::InferBbox'],['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a480ff4d0ebdb8a41e685e3f719b8e607',1,'cv::dnn_objdetect::InferBbox::InferBbox()']]], + ['inference_5fengine_2ehpp_285',['inference_engine.hpp',['https://docs.opencv.org/4.2.0/d8/dcd/inference__engine_8hpp.html',1,'']]], + ['infinity_286',['Infinity',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a7951593b031e13d90223c83d022ce99e',1,'Eigen']]], + ['infinity_287',['infinity',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#ae18eb0704a24559eee8bec962285bef2',1,'std::numeric_limits']]], + ['info_288',['Calibration Info',['../cameraconfig.html#calibinfo',1,'']]], + ['info_289',['info',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ada4cc43c64767d186fcb8997440cc753',1,'Eigen::CholmodBase::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ada4cc43c64767d186fcb8997440cc753',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ada4cc43c64767d186fcb8997440cc753',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ada4cc43c64767d186fcb8997440cc753',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ada4cc43c64767d186fcb8997440cc753',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a5c756a789175197cab3eff3a3e479ef2',1,'Eigen::ColPivHouseholderQR::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a5c756a789175197cab3eff3a3e479ef2',1,'ColPivHouseholderQR< MatrixType >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a1f5c45f78848cfdbb96963cefbbb3274',1,'Eigen::CompleteOrthogonalDecomposition::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#ad4d9d8b90145900b9686d2dabbe46730',1,'Eigen::ComplexEigenSolver::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a8c5ee15fecfd126fc362c3f2fd28f51e',1,'Eigen::ComplexSchur::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a8c5ee15fecfd126fc362c3f2fd28f51e',1,'ComplexSchur< MatrixType >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#ac4af54fadc33abcdd1778c87bfbf005b',1,'Eigen::EigenSolver::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#ada0e68cb22601849464506f5986a88c1',1,'Eigen::IncompleteCholesky::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteLUT.html#a941c7d34f15d7bc287e780636be0ee2b',1,'Eigen::IncompleteLUT::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a0d6b459433a316b4f12d48e5c80d61fe',1,'Eigen::IterativeSolverBase::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a6bd6008501a537d2e16ea672a853bf3e',1,'Eigen::LDLT::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#adb1295e7d2b1fd825a041345ae08be54',1,'Eigen::LLT::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a36bd77afed89f3f5c110a715e69e4c64',1,'Eigen::RealQZ::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a36bd77afed89f3f5c110a715e69e4c64',1,'RealQZ< MatrixType >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a386fd2b1a3a8401eca7183ac074deec8',1,'Eigen::RealSchur::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a386fd2b1a3a8401eca7183ac074deec8',1,'RealSchur< MatrixType >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a31e8a509231e57e684c53799693607ae',1,'Eigen::SelfAdjointEigenSolver::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html#a3ac877f73aaaff670e6ae7554eb02fc8',1,'Eigen::SimplicialCholeskyBase::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a5fad91f861a11cc3c6eae2642eb0d42a',1,'Eigen::SparseLU::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#aa04cc22061d0771f988509c54be3a740',1,'Eigen::SparseQR::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#afbbebf50229522d4487befff158e0d19',1,'Eigen::SPQR::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#aa67da5c8c24110931c949c5896c5ec03',1,'Eigen::SuperLUBase::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#aa67da5c8c24110931c949c5896c5ec03',1,'SuperLUBase< _MatrixType, SuperILU< _MatrixType > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#aa67da5c8c24110931c949c5896c5ec03',1,'SuperLUBase< _MatrixType, SuperLU< _MatrixType > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a06c311bc452dc1ca5abce2f640e15292',1,'Eigen::SVDBase::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a06c311bc452dc1ca5abce2f640e15292',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::info()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UmfPackLU.html#a68738a0d99c67316877706f98b033402',1,'Eigen::UmfPackLU::info()']]], + ['information_290',['Initialization and Information',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html',1,'']]], + ['inheriting_20from_20matrix_291',['Inheriting from Matrix',['https://eigen.tuxfamily.org/dox/TopicCustomizing_InheritingMatrix.html',1,'']]], + ['init_292',['init',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f07de15ae1dea185ddbdd69aa36fcb4',1,'cv::_InputArray::init(int _flags, const void *_obj)'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a296e276ec57703236b468acf43ca7755',1,'cv::_InputArray::init(int _flags, const void *_obj, Size _sz)'],['https://docs.opencv.org/4.2.0/d9/d0b/classcv_1_1tracking_1_1AugmentedUnscentedKalmanFilterParams.html#ae86a211fe5efabccb9a6439a88f197a8',1,'cv::tracking::AugmentedUnscentedKalmanFilterParams::init()'],['https://docs.opencv.org/4.2.0/dc/d72/classcv_1_1ClfMilBoost.html#add6da766c67fd96ffcc90a8230c7b887',1,'cv::ClfMilBoost::init()'],['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a6acf44f4411efd7c3a35c98601791af6',1,'cv::ClfOnlineStump::init()'],['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#aa1887b811d185f3847ec4dd73fa6ac45',1,'cv::CvFeatureEvaluator::init()'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#ad5645b1420dd99681dff89c4ea7ecd64',1,'cv::CvFeatureParams::init()'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#af8a0fbf8f6cb81f50466c8c6d39c04a2',1,'cv::CvHaarEvaluator::init()'],['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#a3411564ba2d415cf995be910c4497928',1,'cv::CvHaarFeatureParams::init()'],['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#a0d767f8bb6542b0a04c6cd5c1875b2f4',1,'cv::CvHOGEvaluator::init()'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#a7663c634ead66984a4e78934a5d94cea',1,'cv::CvLBPEvaluator::init()'],['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a4f136c39c016d3530c7c5801dd1ddb3b',1,'cv::KalmanFilter::init()'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a586631c66b5acecd6105da02936b63a0',1,'cv::saliency::MotionSaliencyBinWangApr2014::init()'],['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#acbe9be31cecb11ea14fcf4b0fafe6f3d',1,'cv::NAryMatIterator::init()'],['https://docs.opencv.org/4.2.0/da/d6a/classcv_1_1face_1_1PredictCollector.html#a67952d3d5e30b1d67cabc38103543562',1,'cv::face::PredictCollector::init()'],['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#abea06e64f8ff2db82711c479b2582f63',1,'cv::face::StandardCollector::init()'],['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a4d285747589b1bdd16d2e4f00c3255dc',1,'cv::Tracker::init()'],['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a23b7cf2dddb0d075a69eee8880f41db3',1,'cv::tracking::UnscentedKalmanFilterParams::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'basic_ios< char, _Traits >::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'basic_iostream< char >::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'basic_istream< char >::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'basic_istream< char, _Traits >::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'basic_ostream< char >::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'basic_ostream< char, _Traits >::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_fstream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_ifstream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_ios::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_iostream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_istream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_istringstream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_ofstream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_ostream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_ostringstream::init()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a62a4b454cbedd686b89e48fa9d6160c4',1,'std::basic_stringstream::init()']]], + ['init_5fscratch_293',['init_scratch',['https://docs.opencv.org/4.2.0/d4/d77/structcv_1_1detail_1_1FluidCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_16cb3b081e952d44068dce53ded07afdc.html#a7dddf7fd06878a65125a3593edb9d076',1,'cv::detail::FluidCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... >, UseScratch >']]], + ['initbaseclassifier_294',['initBaseClassifier',['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html#adf249204640279fe5642afc176d3f0b7',1,'cv::StrongClassifierDirectSelection']]], + ['initcameramatrix2d_295',['initCameraMatrix2D',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga8132c7dbbb61738cc3510bebbdffde55',1,'cv::initCameraMatrix2D()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga8132c7dbbb61738cc3510bebbdffde55',1,'initCameraMatrix2D()(Global Namespace)']]], + ['initcan_296',['initCAN',['../namespacecan.html#ae83e4f4aad3eab06ec0d515db4112bd8',1,'can']]], + ['initcontainer_297',['initContainer',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#ac344a0611fc612f8aedd78fc841dc644',1,'cv::AVIWriteContainer']]], + ['initcuda_298',['initCUDA',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a3f8f7a01976709a0112be796dc8662ad',1,'cv::dnn::Layer']]], + ['initdataset_299',['initDataset',['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a19867eeb429143a99406748d18dde297',1,'cv::datasets::TRACK_alov::initDataset()'],['https://docs.opencv.org/4.2.0/dc/d52/classcv_1_1datasets_1_1TRACK__vot.html#a318e12a6a84809f8fc5d332a5256eda7',1,'cv::datasets::TRACK_vot::initDataset()']]], + ['initdelaunay_300',['initDelaunay',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#ae4a3d65e798c46fd6ce64370f24b0287',1,'cv::Subdiv2D']]], + ['initencoder_301',['initEncoder',['../namespacecan_1_1motor.html#a6a94bbe1a8abe8fd968d4c56658960a7',1,'can::motor']]], + ['inithalide_302',['initHalide',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a0b980c3fbb9d0899484fd0ef1e2b4881',1,'cv::dnn::Layer']]], + ['initialframe_303',['initialFrame',['https://docs.opencv.org/4.2.0/d7/dce/structcv_1_1datasets_1_1groundTruth.html#a65def147b12803d2daa714002fe58196',1,'cv::datasets::groundTruth']]], + ['initialization_304',['Advanced initialization',['https://eigen.tuxfamily.org/dox/group__TutorialAdvancedInitialization.html',1,'']]], + ['initialization_20and_20information_305',['Initialization and Information',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html',1,'']]], + ['initialize_306',['initialize',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a856200bc1f30bed5d7f2a0a9b717783a',1,'cv::rgbd::DepthCleaner::initialize()'],['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#a02b88a2f282b66838e327df030c1d778',1,'cv::multicalib::MultiCameraCalibration::initialize()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#ac7eb4c3b91d478cde76fcfa547c6bc53',1,'cv::rgbd::RgbdNormals::initialize()'],['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#aaf0f7c4128009f02473332a0c41f6345',1,'cv::detail::Timelapser::initialize()'],['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1detail_1_1TimelapserCrop.html#a2115fe1f39d2eae194cc201aa335b7e9',1,'cv::detail::TimelapserCrop::initialize()']]], + ['initialize_5fcleaner_5fimpl_307',['initialize_cleaner_impl',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#ab2603f7fbc0c9da018bb41b27d4225a1',1,'cv::rgbd::DepthCleaner']]], + ['initialize_5fnormals_5fimpl_308',['initialize_normals_impl',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a7ae1d70de30fc78ff67be0b43834cb73',1,'cv::rgbd::RgbdNormals']]], + ['initializecalibration_309',['initializeCalibration',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a97d02afc97ddf9a7eb52ed188b3c5087',1,'cv::omnidir::internal']]], + ['initializecontextfromd3d10device_310',['initializeContextFromD3D10Device',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga7ec329adfc06ad752009722f6942f98a',1,'cv::directx::ocl::initializeContextFromD3D10Device()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga7ec329adfc06ad752009722f6942f98a',1,'initializeContextFromD3D10Device()(Global Namespace)']]], + ['initializecontextfromd3d11device_311',['initializeContextFromD3D11Device',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#gac1d923df82d681aca666ad85835945d1',1,'cv::directx::ocl::initializeContextFromD3D11Device()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#gac1d923df82d681aca666ad85835945d1',1,'initializeContextFromD3D11Device()(Global Namespace)']]], + ['initializecontextfromdirect3ddevice9_312',['initializeContextFromDirect3DDevice9',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga763e240e3ae405e0140198941bd0dcee',1,'cv::directx::ocl::initializeContextFromDirect3DDevice9()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga763e240e3ae405e0140198941bd0dcee',1,'initializeContextFromDirect3DDevice9()(Global Namespace)']]], + ['initializecontextfromdirect3ddevice9ex_313',['initializeContextFromDirect3DDevice9Ex',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#gaf945f3411355162d7de85f842c752add',1,'cv::directx::ocl::initializeContextFromDirect3DDevice9Ex()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#gaf945f3411355162d7de85f842c752add',1,'initializeContextFromDirect3DDevice9Ex()(Global Namespace)']]], + ['initializecontextfromgl_314',['initializeContextFromGL',['https://docs.opencv.org/4.2.0/d1/d36/namespacecv_1_1ogl_1_1ocl.html#a41441ed4320bfc507d81c5e2cbc41233',1,'cv::ogl::ocl']]], + ['initializecontextfromhandle_315',['initializeContextFromHandle',['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a4f09f3d6c49131f686272677278f0851',1,'cv::ocl::Context::initializeContextFromHandle'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#a4f09f3d6c49131f686272677278f0851',1,'cv::ocl::Platform::initializeContextFromHandle'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga497674e2f118f367b2fa4decbcdecb15',1,'cv::ocl::initializeContextFromHandle()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga497674e2f118f367b2fa4decbcdecb15',1,'initializeContextFromHandle()(Global Namespace)']]], + ['initializecontextfromva_316',['initializeContextFromVA',['https://docs.opencv.org/4.2.0/df/df8/namespacecv_1_1va__intel_1_1ocl.html#ac587480336705517740ed6fc734d75c8',1,'cv::va_intel::ocl']]], + ['initializemask_317',['initializeMask',['https://docs.opencv.org/4.2.0/d6/dfb/classcv_1_1BaseCascadeClassifier_1_1MaskGenerator.html#a9c3e42721d7217d91f6a039fb9ca4181',1,'cv::BaseCascadeClassifier::MaskGenerator']]], + ['initializer_5flist_318',['initializer_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01663.html',1,'std::initializer_list< _E >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00029.html',1,'(Global Namespace)']]], + ['initializer_5flist_5ft_319',['initializer_list_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac569f292a070dfd2f6b69c16e746095a.html#ac569f292a070dfd2f6b69c16e746095a',1,'nlohmann::basic_json']]], + ['initializestereocalibration_320',['initializeStereoCalibration',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a2d7b8bdafac8a51c8b3ff2a7038fb5c5',1,'cv::omnidir::internal']]], + ['initialvalue_321',['initialValue',['https://docs.opencv.org/4.2.0/da/dad/structcv_1_1cudev_1_1Avg.html#ab9cc97494beba0a82139a3d145887bb6',1,'cv::cudev::Avg::initialValue()'],['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1cudev_1_1Max.html#a2b4d2bef95975274383029988ae6fea9',1,'cv::cudev::Max::initialValue()'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1Min.html#aeff4aea67655d22a826f5a6ed642b522',1,'cv::cudev::Min::initialValue()'],['https://docs.opencv.org/4.2.0/d8/d60/structcv_1_1cudev_1_1Sum.html#a447f0dc40f45b77635d8e87a144b9e18',1,'cv::cudev::Sum::initialValue()']]], + ['initimpl_322',['initImpl',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ace2f85404fb03491e9a36bc6ba595e97',1,'cv::superres::SuperResolution::initImpl()'],['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a75432dee954b2f6886f41f057348ac38',1,'cv::Tracker::initImpl()']]], + ['initinfengine_323',['initInfEngine',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a12e3a5730c04d9eb3944883bfe94ed4a',1,'cv::dnn::Layer']]], + ['initinrad_324',['initInRad',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a3af23327d804a96f4a0250b07c2510d5',1,'cv::TrackerSamplerCSC::Params']]], + ['initmaxnegnum_325',['initMaxNegNum',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a7a601f12984ead5da07d9d4a37d12182',1,'cv::TrackerSamplerCSC::Params']]], + ['initmotor_326',['initMotor',['../namespacecan_1_1motor.html#aed6d24cbbf89da0bb3eb1dc11bc8b72e',1,'can::motor']]], + ['initngraph_327',['initNgraph',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#aff6da8252d3558dbb23251b035aff5f6',1,'cv::dnn::Layer']]], + ['initpotentiometer_328',['initPotentiometer',['../namespacecan_1_1motor.html#a7831a61147dcf3f0a72e80878ae13bfa',1,'can::motor']]], + ['initshape_5fn_329',['initShape_n',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a018a08825953d5ee1ee41395fc6d520b',1,'cv::face::FacemarkLBF::Params']]], + ['initstream_330',['initStream',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#af4edbcdb9f9c421b0909f02e01a636c8',1,'cv::AVIReadContainer::initStream(const String &filename)'],['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a9f5a144ae2c2895500eb815c6ccdc722',1,'cv::AVIReadContainer::initStream(Ptr< VideoInputStream > m_file_stream_)']]], + ['initundistortrectifymap_331',['initUndistortRectifyMap',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga7dfb72c9cf9780a347fbe3d1c47e5d5a',1,'cv::initUndistortRectifyMap()'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga0d37b45f780b32f63ed19c21aa9fd333',1,'cv::fisheye::initUndistortRectifyMap()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga0d0b216ff9c9c2cee1ab9cc13cc20faa',1,'cv::omnidir::initUndistortRectifyMap()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga7dfb72c9cf9780a347fbe3d1c47e5d5a',1,'initUndistortRectifyMap(InputArray cameraMatrix, InputArray distCoeffs, InputArray R, InputArray newCameraMatrix, Size size, int m1type, OutputArray map1, OutputArray map2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga0d37b45f780b32f63ed19c21aa9fd333',1,'initUndistortRectifyMap(InputArray K, InputArray D, InputArray R, InputArray P, const cv::Size &size, int m1type, OutputArray map1, OutputArray map2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga0d0b216ff9c9c2cee1ab9cc13cc20faa',1,'initUndistortRectifyMap(InputArray K, InputArray D, InputArray xi, InputArray R, InputArray P, const cv::Size &size, int mltype, OutputArray map1, OutputArray map2, int flags)(Global Namespace)']]], + ['initvkcom_332',['initVkCom',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a95515bef8a2b8525248c1d7588c672be',1,'cv::dnn::Layer']]], + ['initwideangleprojmap_333',['initWideAngleProjMap',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga9185f4fbe1ad74af2c56a392393cf9f4',1,'cv::initWideAngleProjMap(InputArray cameraMatrix, InputArray distCoeffs, Size imageSize, int destImageWidth, int m1type, OutputArray map1, OutputArray map2, enum UndistortTypes projType=PROJ_SPHERICAL_EQRECT, double alpha=0)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gacc07e561972abd7dcfe4a3dc00b7bb8b',1,'cv::initWideAngleProjMap(InputArray cameraMatrix, InputArray distCoeffs, Size imageSize, int destImageWidth, int m1type, OutputArray map1, OutputArray map2, int projType, double alpha=0)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga9185f4fbe1ad74af2c56a392393cf9f4',1,'initWideAngleProjMap(InputArray cameraMatrix, InputArray distCoeffs, Size imageSize, int destImageWidth, int m1type, OutputArray map1, OutputArray map2, enum UndistortTypes projType=PROJ_SPHERICAL_EQRECT, double alpha=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gacc07e561972abd7dcfe4a3dc00b7bb8b',1,'initWideAngleProjMap(InputArray cameraMatrix, InputArray distCoeffs, Size imageSize, int destImageWidth, int m1type, OutputArray map1, OutputArray map2, int projType, double alpha=0)(Global Namespace)']]], + ['initwithparentview_3a_334',['initWithParentView:',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a45844ae7e6af93e3dcaa97aae70e5cf8',1,'CvAbstractCamera']]], + ['inliers_5fmask_335',['inliers_mask',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#a6ff92ca46d2d3f23a80a0bd4303e356f',1,'cv::detail::MatchesInfo']]], + ['inline_336',['InLine',['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#a45f9a5dcce9ba46408e5682bffef1d1d',1,'cv::gapi::fluid::View']]], + ['inlineb_337',['InLineB',['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#a5d71fe1063a955ed7d1b8c3bfed93a54',1,'cv::gapi::fluid::View']]], + ['inmat_338',['inMat',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#a13cc322f7ec86270d7cb72466c29c910',1,'cv::GCPUContext::inMat()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a782ca6fe7ba966201c558fc837845c22',1,'cv::GOCLContext::inMat()']]], + ['inner_339',['inner',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ab827ee701f5ccbd8f9bdeb32497df572',1,'Eigen::Stride::inner()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ab827ee701f5ccbd8f9bdeb32497df572',1,'Stride< 0, Value >::inner()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ab827ee701f5ccbd8f9bdeb32497df572',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::inner()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ab827ee701f5ccbd8f9bdeb32497df572',1,'Stride< Value, 0 >::inner()']]], + ['inner_5fproduct_340',['inner_product',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga721f223f1581a1054b7f55c4b456dd57',1,'std::inner_product(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _Tp __init)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga20b37d44d13d779f7eab4a1ac98ca674',1,'std::inner_product(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _Tp __init, _BinaryOperation1 __binary_op1, _BinaryOperation2 __binary_op2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga721f223f1581a1054b7f55c4b456dd57',1,'inner_product(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _Tp __init)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga20b37d44d13d779f7eab4a1ac98ca674',1,'inner_product(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _Tp __init, _BinaryOperation1 __binary_op1, _BinaryOperation2 __binary_op2)(Global Namespace)']]], + ['innerindexptr_341',['innerIndexPtr',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'Eigen::SparseCompressedBase::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'Eigen::SparseCompressedBase::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< Derived >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< Derived >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d3fd9bf7f186dbfd4297d0dd003cabf',1,'SparseCompressedBase< Transpose< MatrixType > >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac0c50033e593cfe2729012fa4f8cb79e',1,'SparseCompressedBase< Transpose< MatrixType > >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#ab044564756f472877b2c1a5706e540e2',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html#af5cd1f13dde8578eb9891a4ac4a11977',1,'Eigen::SparseMapBase< Derived, WriteAccessors >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a8e9ef5d399d36fdd860ad05cb7a31455',1,'Eigen::SparseMatrix::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae7b804bd39745156d20ca1611a296b67',1,'Eigen::SparseMatrix::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a8e9ef5d399d36fdd860ad05cb7a31455',1,'SparseMatrix< Scalar >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae7b804bd39745156d20ca1611a296b67',1,'SparseMatrix< Scalar >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a8e9ef5d399d36fdd860ad05cb7a31455',1,'SparseMatrix< Scalar, ColMajor, int >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae7b804bd39745156d20ca1611a296b67',1,'SparseMatrix< Scalar, ColMajor, int >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a8e9ef5d399d36fdd860ad05cb7a31455',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae7b804bd39745156d20ca1611a296b67',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::innerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a8e9ef5d399d36fdd860ad05cb7a31455',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::innerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae7b804bd39745156d20ca1611a296b67',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::innerIndexPtr() const']]], + ['innernonzeroptr_342',['innerNonZeroPtr',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'Eigen::SparseCompressedBase::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'Eigen::SparseCompressedBase::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< Derived >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< Derived >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ac8dad03980598adb585dbc1cee32d977',1,'SparseCompressedBase< Transpose< MatrixType > >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a7780293a4b936231f7d0b687bc50347c',1,'SparseCompressedBase< Transpose< MatrixType > >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a2b35a1d701d6c6ea36b2d9f19660a68c',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html#af877ea4e285a4497f80987fea66f7459',1,'Eigen::SparseMapBase< Derived, WriteAccessors >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a00efb5c30c29bbc826d156d97e60d870',1,'Eigen::SparseMatrix::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a218204b051a24f579c394454786eeda0',1,'Eigen::SparseMatrix::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a00efb5c30c29bbc826d156d97e60d870',1,'SparseMatrix< Scalar >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a218204b051a24f579c394454786eeda0',1,'SparseMatrix< Scalar >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a00efb5c30c29bbc826d156d97e60d870',1,'SparseMatrix< Scalar, ColMajor, int >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a218204b051a24f579c394454786eeda0',1,'SparseMatrix< Scalar, ColMajor, int >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a00efb5c30c29bbc826d156d97e60d870',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a218204b051a24f579c394454786eeda0',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::innerNonZeroPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a00efb5c30c29bbc826d156d97e60d870',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::innerNonZeroPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a218204b051a24f579c394454786eeda0',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::innerNonZeroPtr() const']]], + ['innerparameters_343',['InnerParameters',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html',1,'cv::DetectionBasedTracker::InnerParameters'],['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a662f0418b8db17892b95a5f87ce35c99',1,'cv::DetectionBasedTracker::InnerParameters::InnerParameters()']]], + ['innerparameters_344',['innerParameters',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ad8a9583eced7508072d910188c97f4bf',1,'cv::DetectionBasedTracker']]], + ['innerproductlayer_345',['InnerProductLayer',['https://docs.opencv.org/4.2.0/d0/dc7/classcv_1_1dnn_1_1InnerProductLayer.html',1,'cv::dnn']]], + ['innersize_346',['innerSize',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58ca41d9635a8ab3c5a268ef3f7f0d75',1,'Eigen::DenseBase::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58ca41d9635a8ab3c5a268ef3f7f0d75',1,'DenseBase< ArrayWrapper< ExpressionType > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58ca41d9635a8ab3c5a268ef3f7f0d75',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58ca41d9635a8ab3c5a268ef3f7f0d75',1,'DenseBase< Solve< Decomposition, RhsType > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a0df6dba8d71e0fb15b2995510853f83e',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0f42824d4a06ee1d1f6afbc4551c5896',1,'Eigen::SparseMatrix::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0f42824d4a06ee1d1f6afbc4551c5896',1,'SparseMatrix< Scalar >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0f42824d4a06ee1d1f6afbc4551c5896',1,'SparseMatrix< Scalar, ColMajor, int >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0f42824d4a06ee1d1f6afbc4551c5896',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0f42824d4a06ee1d1f6afbc4551c5896',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a180fcba1ccf3cdf3252a263bc1de7a1d',1,'Eigen::SparseMatrixBase::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a180fcba1ccf3cdf3252a263bc1de7a1d',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a180fcba1ccf3cdf3252a263bc1de7a1d',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a180fcba1ccf3cdf3252a263bc1de7a1d',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a180fcba1ccf3cdf3252a263bc1de7a1d',1,'SparseMatrixBase< Transpose< MatrixType > >::innerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a180fcba1ccf3cdf3252a263bc1de7a1d',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::innerSize()']]], + ['innerstride_347',['InnerStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1InnerStride.html',1,'Eigen']]], + ['innerstride_348',['innerStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#a8b17f1bcdb474072e079bb1a7926ef7f',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::innerStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#a4e94e17926e1cf597deb2928e779cef6',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::innerStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#ad3252106d7e004d3410238cab92e3258',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::innerStride()']]], + ['inpaint_349',['inpaint',['https://docs.opencv.org/4.2.0/d1/dc6/classcv_1_1videostab_1_1ColorAverageInpainter.html#a7bf533cc935a428ff95f1cdae2416b91',1,'cv::videostab::ColorAverageInpainter::inpaint()'],['https://docs.opencv.org/4.2.0/d3/d2b/classcv_1_1videostab_1_1ColorInpainter.html#af1bd2c6dcd4c69fcc9202d4fda364e94',1,'cv::videostab::ColorInpainter::inpaint()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1videostab_1_1ConsistentMosaicInpainter.html#a1c7d7469200ede9d31eda981d28c6581',1,'cv::videostab::ConsistentMosaicInpainter::inpaint()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#aa3a1cba9518b2afbad928859b073ad93',1,'cv::videostab::InpainterBase::inpaint()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a2461fddc037a498cabfaf6cd32f25ece',1,'cv::videostab::InpaintingPipeline::inpaint()'],['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#ae84c8c9f0a5d18bf44e2f4c11b547aa0',1,'cv::videostab::MotionInpainter::inpaint()'],['https://docs.opencv.org/4.2.0/d4/d1d/classcv_1_1videostab_1_1NullInpainter.html#ac61df81a5ccea0f8595b73954650da52',1,'cv::videostab::NullInpainter::inpaint()'],['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html#gaedd30dfa0214fec4c88138b51d678085',1,'cv::inpaint()'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga62fa7703db24939ad65d7a799e8e599e',1,'cv::ft::inpaint()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gab4febba6be53e5fddc480b8cedf51eee',1,'cv::xphoto::inpaint()'],['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html#gaedd30dfa0214fec4c88138b51d678085',1,'inpaint(InputArray src, InputArray inpaintMask, OutputArray dst, double inpaintRadius, int flags)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga62fa7703db24939ad65d7a799e8e599e',1,'inpaint(InputArray image, InputArray mask, OutputArray output, int radius, int function, int algorithm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gab4febba6be53e5fddc480b8cedf51eee',1,'inpaint(const Mat &src, const Mat &mask, Mat &dst, const int algorithmType)(Global Namespace)']]], + ['inpaint_5ffsr_5fbest_350',['INPAINT_FSR_BEST',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ggaac254ca51291f930a86502adc834a87dab95b58c30e74bb1dd6ad77fa5d75140b',1,'cv::xphoto::INPAINT_FSR_BEST'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ggaac254ca51291f930a86502adc834a87dab95b58c30e74bb1dd6ad77fa5d75140b',1,'INPAINT_FSR_BEST(Global Namespace)']]], + ['inpaint_5ffsr_5ffast_351',['INPAINT_FSR_FAST',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ggaac254ca51291f930a86502adc834a87daedfca54293916a29f9e3bca4e780c520',1,'cv::xphoto::INPAINT_FSR_FAST'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ggaac254ca51291f930a86502adc834a87daedfca54293916a29f9e3bca4e780c520',1,'INPAINT_FSR_FAST(Global Namespace)']]], + ['inpaint_5fns_352',['INPAINT_NS',['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html#gga45962890a6f4f2e921922f4db5e29b92a05e763003a805e6c11c673a9f4ba7d07',1,'cv::INPAINT_NS'],['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html#gga45962890a6f4f2e921922f4db5e29b92a05e763003a805e6c11c673a9f4ba7d07',1,'INPAINT_NS(Global Namespace)']]], + ['inpaint_5fshiftmap_353',['INPAINT_SHIFTMAP',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ggaac254ca51291f930a86502adc834a87da4e1f6f6e76837e282aff24dc73f97bf3',1,'cv::xphoto::INPAINT_SHIFTMAP'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ggaac254ca51291f930a86502adc834a87da4e1f6f6e76837e282aff24dc73f97bf3',1,'INPAINT_SHIFTMAP(Global Namespace)']]], + ['inpaint_5ftelea_354',['INPAINT_TELEA',['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html#gga45962890a6f4f2e921922f4db5e29b92a892824c38e258feb5e72f308a358d52e',1,'cv::INPAINT_TELEA'],['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html#gga45962890a6f4f2e921922f4db5e29b92a892824c38e258feb5e72f308a358d52e',1,'INPAINT_TELEA(Global Namespace)']]], + ['inpainter_355',['inpainter',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#afe5046c6efef3aef80125d7d61a4dab1',1,'cv::videostab::StabilizerBase']]], + ['inpainter_5f_356',['inpainter_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aa6997fb6ae1915a8df3c0d7f58f7ed8b',1,'cv::videostab::StabilizerBase']]], + ['inpainterbase_357',['InpainterBase',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html',1,'cv::videostab::InpainterBase'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a74429e890d897eb24d38087b253ea727',1,'cv::videostab::InpainterBase::InpainterBase()']]], + ['inpainting_358',['Inpainting',['https://docs.opencv.org/4.2.0/df/d3d/tutorial_py_inpainting.html',1,'Image Inpainting'],['https://docs.opencv.org/4.2.0/dc/d2f/tutorial_xphoto_inpainting.html',1,'Image Inpainting'],['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html',1,'Inpainting']]], + ['inpainting_20using_20f_20transform_359',['Inpainting using F-transform',['https://docs.opencv.org/4.2.0/d3/db8/tutorial_fuzzy_inpainting.html',1,'']]], + ['inpainting_2ehpp_360',['inpainting.hpp',['https://docs.opencv.org/4.2.0/dc/dc7/videostab_2include_2opencv2_2videostab_2inpainting_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d72/xphoto_2include_2opencv2_2xphoto_2inpainting_8hpp.html',1,'(Global Namespace)']]], + ['inpainting_2emarkdown_361',['inpainting.markdown',['https://docs.opencv.org/4.2.0/d0/d0f/inpainting_8markdown.html',1,'']]], + ['inpaintingmask_5f_362',['inpaintingMask_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a8e07199a116143e55c3566c722350b93',1,'cv::videostab::StabilizerBase']]], + ['inpaintingpipeline_363',['InpaintingPipeline',['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html',1,'cv::videostab']]], + ['inpainttypes_364',['InpaintTypes',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gaac254ca51291f930a86502adc834a87d',1,'cv::xphoto::InpaintTypes'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gaac254ca51291f930a86502adc834a87d',1,'InpaintTypes(Global Namespace)']]], + ['inplace_20matrix_20decompositions_365',['Inplace matrix decompositions',['https://eigen.tuxfamily.org/dox/group__InplaceDecomposition.html',1,'']]], + ['inplace_5fmerge_366',['inplace_merge',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga5e5479e1ac5e92b0c1f77bcf762d07e9',1,'std::inplace_merge(_BidirectionalIterator __first, _BidirectionalIterator __middle, _BidirectionalIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaf6a8379ab8a648fd05d52ed0632081fa',1,'std::inplace_merge(_BidirectionalIterator __first, _BidirectionalIterator __middle, _BidirectionalIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga5e5479e1ac5e92b0c1f77bcf762d07e9',1,'inplace_merge(_BidirectionalIterator __first, _BidirectionalIterator __middle, _BidirectionalIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaf6a8379ab8a648fd05d52ed0632081fa',1,'inplace_merge(_BidirectionalIterator __first, _BidirectionalIterator __middle, _BidirectionalIterator __last, _Compare __comp)(Global Namespace)']]], + ['input_20and_20output_20imgcodecs_20module_367',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], + ['input_20and_20output_20using_20xml_20and_20yaml_20files_368',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], + ['input_20and_20output_20videoio_20module_369',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], + ['input_20output_370',['Input/Output',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html',1,'']]], + ['input_20with_20opencv_20and_20similarity_20measurement_371',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], + ['input_5fformat_5ft_372',['input_format_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a211cf53702226ad9fb3c939a3a3d3689.html#a211cf53702226ad9fb3c939a3a3d3689',1,'nlohmann::basic_json']]], + ['input_5fiterator_5ftag_373',['input_iterator_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07691.html',1,'std']]], + ['input_5fnames_374',['input_names',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#af23f13d4a2063df67603b64941af4cc3',1,'cv::gapi::ie::detail::ParamDesc']]], + ['inputarray_375',['InputArray',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga353a9de602fe76c709e12074a6f362ba',1,'cv::InputArray'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga353a9de602fe76c709e12074a6f362ba',1,'InputArray(Global Namespace)']]], + ['inputarrayofarrays_376',['InputArrayOfArrays',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga606feabe3b50ab6838f1ba89727aa07a',1,'cv::InputArrayOfArrays'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga606feabe3b50ab6838f1ba89727aa07a',1,'InputArrayOfArrays(Global Namespace)']]], + ['inputnametoindex_377',['inputNameToIndex',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a93212cf0fe50ace40af0f2b4f42263c4',1,'cv::dnn::Layer::inputNameToIndex()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a65ab14f117c7086b23e3429f50d6866e',1,'cv::dnn::LSTMLayer::inputNameToIndex()']]], + ['inputoutputarray_378',['InputOutputArray',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf77c9a14ef956c50c1efd4547f444e63',1,'cv::InputOutputArray'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf77c9a14ef956c50c1efd4547f444e63',1,'InputOutputArray(Global Namespace)']]], + ['inputoutputarrayofarrays_379',['InputOutputArrayOfArrays',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8899575c0929a56ab8bdd01cf34ebcb1',1,'cv::InputOutputArrayOfArrays'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8899575c0929a56ab8bdd01cf34ebcb1',1,'InputOutputArrayOfArrays(Global Namespace)']]], + ['inrange_380',['inRange',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga48af0ab51e36436c5d04340e036ce981',1,'cv::inRange()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga76246465115220c5e5986a55298300c7',1,'cv::gapi::inRange()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga48af0ab51e36436c5d04340e036ce981',1,'inRange(InputArray src, InputArray lowerb, InputArray upperb, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga76246465115220c5e5986a55298300c7',1,'inRange(const GMat &src, const GScalar &threshLow, const GScalar &threshUp)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d97/tutorial_threshold_inRange.html',1,'Thresholding Operations using inRange']]], + ['insert_381',['insert',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a18a6c9999210d769538297d843c613f2',1,'cv::Subdiv2D::insert(Point2f pt)'],['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a37223a499032ef57364f1372ad0c9c2e',1,'cv::Subdiv2D::insert(const std::vector< Point2f > &ptvec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae2330468c2acd43907a611293334baf0',1,'__gnu_cxx::__versa_string::insert(const_iterator __p, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9f4193d5c08023732ca08b2e3b069b55',1,'__gnu_cxx::__versa_string::insert(const_iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a801fdd1dc9aaa55ef858fcf5414ae385',1,'__gnu_cxx::__versa_string::insert(const_iterator __p, std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a3f98b8577d9a4c1a9d01216e4c308136',1,'__gnu_cxx::__versa_string::insert(size_type __pos1, const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a5a80f90cbf0f3913738a1480b3a1bd86',1,'__gnu_cxx::__versa_string::insert(size_type __pos1, const __versa_string &__str, size_type __pos2, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a90943cd50dde194d35e6efb62165a53d',1,'__gnu_cxx::__versa_string::insert(size_type __pos, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a99de3540d81c73d650f605329019a161',1,'__gnu_cxx::__versa_string::insert(size_type __pos, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2f59bd59e348597a85efa6b068013b33',1,'__gnu_cxx::__versa_string::insert(size_type __pos, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a11bac87efc12b1fc97b0508ce66a4eff',1,'__gnu_cxx::__versa_string::insert(const_iterator __p, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'__gnu_debug::basic_string::insert(iterator __p, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'__gnu_debug::basic_string::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'__gnu_debug::basic_string::insert(iterator __p, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'__gnu_debug::basic_string::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'__gnu_debug::basic_string::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'__gnu_debug::basic_string::insert(iterator __p, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< _CharT >::insert(iterator __p, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< _CharT >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< _CharT >::insert(iterator __p, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< _CharT >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< _CharT >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< _CharT >::insert(size_type __pos, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< _CharT >::insert(size_type __pos, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< _CharT >::insert(size_type __pos, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< _CharT >::insert(iterator __p, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< _CharT, _Traits, _Allocator >::insert(iterator __p, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< _CharT, _Traits, _Allocator >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< _CharT, _Traits, _Allocator >::insert(iterator __p, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< _CharT, _Traits, _Allocator >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< _CharT, _Traits, _Allocator >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< _CharT, _Traits, _Allocator >::insert(size_type __pos, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< _CharT, _Traits, _Allocator >::insert(size_type __pos, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< _CharT, _Traits, _Allocator >::insert(size_type __pos, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< _CharT, _Traits, _Allocator >::insert(iterator __p, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(iterator __p, size_type __n, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(iterator __p, initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(size_type __pos, const _Elem *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(size_type __pos, const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(size_type __pos, size_type __n, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::insert(iterator __p, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< char >::insert(iterator __p, size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< char >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< char >::insert(iterator __p, initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< char >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< char >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< char >::insert(size_type __pos, const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< char >::insert(size_type __pos, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< char >::insert(size_type __pos, size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< char >::insert(iterator __p, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(iterator __p, size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(iterator __p, initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(size_type __pos, const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(size_type __pos, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(size_type __pos, size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< char, char_traits< char >, _Byte_alloc >::insert(iterator __p, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< char_type, _Traits, _Alloc >::insert(iterator __p, size_type __n, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< char_type, _Traits, _Alloc >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< char_type, _Traits, _Alloc >::insert(iterator __p, initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< char_type, _Traits, _Alloc >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< char_type, _Traits, _Alloc >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< char_type, _Traits, _Alloc >::insert(size_type __pos, const char_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< char_type, _Traits, _Alloc >::insert(size_type __pos, const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< char_type, _Traits, _Alloc >::insert(size_type __pos, size_type __n, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< char_type, _Traits, _Alloc >::insert(iterator __p, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'basic_string< value_type >::insert(iterator __p, size_type __n, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'basic_string< value_type >::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'basic_string< value_type >::insert(iterator __p, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'basic_string< value_type >::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'basic_string< value_type >::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'basic_string< value_type >::insert(size_type __pos, const value_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'basic_string< value_type >::insert(size_type __pos, const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'basic_string< value_type >::insert(size_type __pos, size_type __n, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'basic_string< value_type >::insert(iterator __p, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a69b4ca4a5aad67e979d6e6db9b31781a',1,'deque< _StateSeqT >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#adec6ee2ba1f059f0addf6b9da5b596e1',1,'deque< _StateSeqT >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a755a6d05ef2270de50ce270bea77250f',1,'deque< _StateSeqT >::insert(const_iterator __p, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ad645c0144212cbfee911daa80578e997',1,'deque< _StateSeqT >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#aee2b0dd83e2d5c82db3b2df6918e484a',1,'deque< _StateSeqT >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a0b44f76b96a458895a1e8c6e4057b8dd',1,'list< __inp, __rebind_inp >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a2b70528dcf0f77ddb45429d463de07e4',1,'list< __inp, __rebind_inp >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#af9214e29cd05b8446678285415fb6f1e',1,'list< __inp, __rebind_inp >::insert(const_iterator __p, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3660a3d042a5605cde9ecc59e4b9b17c',1,'list< __inp, __rebind_inp >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a9a552f1f8f2fd43351184e6676b1fea1',1,'list< __inp, __rebind_inp >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'match_results< _Bi_iter >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'match_results< _Bi_iter >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'match_results< _Bi_iter >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'match_results< _Bi_iter >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'match_results< _Bi_iter >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e9371291649e0ef913b1db6eca30fe6',1,'std::basic_string::insert(iterator __p, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adfba5cd6a9aa65ba311bccf50cb372f1',1,'std::basic_string::insert(iterator __p, _InputIterator __beg, _InputIterator __end)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a222550ae5e2797c94ec1843e1c5d534d',1,'std::basic_string::insert(iterator __p, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a573db36b336dacb30f9597947fb9cbba',1,'std::basic_string::insert(size_type __pos1, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5f4cb009e10c77720a50e15b43881053',1,'std::basic_string::insert(size_type __pos1, const basic_string &__str, size_type __pos2, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5ddc3f0696e69ba341e5cbdc78a1a727',1,'std::basic_string::insert(size_type __pos, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#acc1fcf315c8dfe30d0f84465e5d9f033',1,'std::basic_string::insert(size_type __pos, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae866142460e73e83a99d2cd13a0252ae',1,'std::basic_string::insert(size_type __pos, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afd1100ed98bdacbf118baaf860bb2feb',1,'std::basic_string::insert(iterator __p, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a69b4ca4a5aad67e979d6e6db9b31781a',1,'std::deque::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#adec6ee2ba1f059f0addf6b9da5b596e1',1,'std::deque::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a755a6d05ef2270de50ce270bea77250f',1,'std::deque::insert(const_iterator __p, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ad645c0144212cbfee911daa80578e997',1,'std::deque::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#aee2b0dd83e2d5c82db3b2df6918e484a',1,'std::deque::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a0b44f76b96a458895a1e8c6e4057b8dd',1,'std::list::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a2b70528dcf0f77ddb45429d463de07e4',1,'std::list::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#af9214e29cd05b8446678285415fb6f1e',1,'std::list::insert(const_iterator __p, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3660a3d042a5605cde9ecc59e4b9b17c',1,'std::list::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a9a552f1f8f2fd43351184e6676b1fea1',1,'std::list::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ab228710aaa8c81fc3b7fe37b26fc709a',1,'std::map::insert(std::initializer_list< value_type > __list)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a3186e7576e4ffc474fd92f66e460d231',1,'std::map::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a3a5341d2ce3f2ffa4426d29110ca8e41',1,'std::map::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a94b8084648ff490a86c7cf951f537a37',1,'std::map::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ad95452a6c3677b7176b6b8e3d24e9176',1,'std::map::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#aa0d825fbc11a62dc06420646e0c90dd5',1,'std::map::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a99ddc0c2cfe1d8a8cac10a2b59207c68',1,'std::map::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a9296f57a3c7c517446504a256dcc48de',1,'std::map::insert(const_iterator __position, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a3a5341d2ce3f2ffa4426d29110ca8e41',1,'std::map::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a94b8084648ff490a86c7cf951f537a37',1,'std::map::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ad95452a6c3677b7176b6b8e3d24e9176',1,'std::map::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#aa0d825fbc11a62dc06420646e0c90dd5',1,'std::map::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a99ddc0c2cfe1d8a8cac10a2b59207c68',1,'std::map::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a9296f57a3c7c517446504a256dcc48de',1,'std::map::insert(const_iterator __position, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'std::match_results::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'std::match_results::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'std::match_results::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'std::match_results::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'std::match_results::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a36587a799aa76b39df686435ed846cd1',1,'std::multimap::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a051e304a855790e3be5171f64196b7b6',1,'std::multimap::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ab73db27102f8da23a1aa18ae7b14d2c1',1,'std::multimap::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a7daafbe374e255fcb4e044e75e1c4b1a',1,'std::multimap::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a0fa7a92b05bab64bac54cd6eb322a50c',1,'std::multimap::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ae496df8209ddbbf8f661a469f7624ddb',1,'std::multimap::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1b3bf0fd80e918b53b3be7cf135dca87',1,'std::multimap::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#abc8aea1bb476f6913ffe1afbdd29178b',1,'std::multimap::insert(const_iterator __position, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ab73db27102f8da23a1aa18ae7b14d2c1',1,'std::multimap::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a7daafbe374e255fcb4e044e75e1c4b1a',1,'std::multimap::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a0fa7a92b05bab64bac54cd6eb322a50c',1,'std::multimap::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ae496df8209ddbbf8f661a469f7624ddb',1,'std::multimap::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1b3bf0fd80e918b53b3be7cf135dca87',1,'std::multimap::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#abc8aea1bb476f6913ffe1afbdd29178b',1,'std::multimap::insert(const_iterator __position, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a6a95194c5c1aa0caf2d2f852def99bfc',1,'std::multiset::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ad039dc1cb5c117a62ab8ff56fef14a22',1,'std::multiset::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a7229e1145054a27d23f88a185085f7ec',1,'std::multiset::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a70689e1641f42b649d8237b0c6ba6592',1,'std::multiset::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af168dfb4d8e0515557884b2619117c78',1,'std::set::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#abe856758e09628d4ec26d1e77ceee152',1,'std::set::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aa383fd1111f8ced96c22eacf1e42c258',1,'std::set::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a555b9e2cf15a4d3aac095883904743a8',1,'std::set::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0c40f8641ff4ca47fe2998a46404cf37',1,'std::unordered_map::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a191d1d95c2d102dc1057677df000aaec',1,'std::unordered_map::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a047d2b3433747276ee6daa9eba154295',1,'std::unordered_map::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adb80cc201b9b5b821e8ef73492106db3',1,'std::unordered_map::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aae182defe617c8d37e27b27b09277ea9',1,'std::unordered_map::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3eb7753105411145e2d8476cf300b348',1,'std::unordered_map::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a01d23be5cd83c13117d269bc1df1488f',1,'std::unordered_map::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae4f015606d8e138c72eb87ce5f89ed50',1,'std::unordered_map::insert(const_iterator __hint, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a047d2b3433747276ee6daa9eba154295',1,'std::unordered_map::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adb80cc201b9b5b821e8ef73492106db3',1,'std::unordered_map::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aae182defe617c8d37e27b27b09277ea9',1,'std::unordered_map::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3eb7753105411145e2d8476cf300b348',1,'std::unordered_map::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a01d23be5cd83c13117d269bc1df1488f',1,'std::unordered_map::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae4f015606d8e138c72eb87ce5f89ed50',1,'std::unordered_map::insert(const_iterator __hint, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a46f035c31a44c4051965af7868d40e77',1,'std::unordered_multimap::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#acb1935806673ced5dae48aa64d8cabc3',1,'std::unordered_multimap::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a79303f819716015a95be11962dda3e53',1,'std::unordered_multimap::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a73f5c66280686af351a204b1d98774b6',1,'std::unordered_multimap::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ade6cdef7282f352738f0a2bde236cf06',1,'std::unordered_multimap::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aeb4625ec1e0a22af00ccb220e4c7c7b2',1,'std::unordered_multimap::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af90dcd39d44bdeffe788e78ca829d639',1,'std::unordered_multimap::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af7389296b49f59cc5a612fd769daaeeb',1,'std::unordered_multimap::insert(const_iterator __hint, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a79303f819716015a95be11962dda3e53',1,'std::unordered_multimap::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a73f5c66280686af351a204b1d98774b6',1,'std::unordered_multimap::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ade6cdef7282f352738f0a2bde236cf06',1,'std::unordered_multimap::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aeb4625ec1e0a22af00ccb220e4c7c7b2',1,'std::unordered_multimap::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af90dcd39d44bdeffe788e78ca829d639',1,'std::unordered_multimap::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af7389296b49f59cc5a612fd769daaeeb',1,'std::unordered_multimap::insert(const_iterator __hint, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a914954becc1ec4a1bec63eafe11065e1',1,'std::unordered_multiset::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0e45e9fa99b643fb6a79c4154c00dcb4',1,'std::unordered_multiset::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aa8ed787cbd107c6e469d92d0ab4d2836',1,'std::unordered_multiset::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aa888dc9e6ebd2d05342de7efac99e55c',1,'std::unordered_multiset::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0a7ead2d0db3cfaf291968f0967cf242',1,'std::unordered_multiset::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aadc4a113c0ce8991df621858a74e063b',1,'std::unordered_multiset::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aa8ed787cbd107c6e469d92d0ab4d2836',1,'std::unordered_multiset::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aa888dc9e6ebd2d05342de7efac99e55c',1,'std::unordered_multiset::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0a7ead2d0db3cfaf291968f0967cf242',1,'std::unordered_multiset::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aadc4a113c0ce8991df621858a74e063b',1,'std::unordered_multiset::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ab8d7bdf04f958f040cfd842c6e2d7b6b',1,'std::unordered_set::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#adaa06dc3ca7393564cf03ce38cbe5d74',1,'std::unordered_set::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ac9fa0bc82f5e6fae38a8d225f468608d',1,'std::unordered_set::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#abc0147e25845cc780f71f1b14cd41cce',1,'std::unordered_set::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a6b211cbe01ddf94104caf45b393ae933',1,'std::unordered_set::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a9e27a7160d0253be3bc02bf9c2fd4d62',1,'std::unordered_set::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ac9fa0bc82f5e6fae38a8d225f468608d',1,'std::unordered_set::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#abc0147e25845cc780f71f1b14cd41cce',1,'std::unordered_set::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a6b211cbe01ddf94104caf45b393ae933',1,'std::unordered_set::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a9e27a7160d0253be3bc02bf9c2fd4d62',1,'std::unordered_set::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'std::vector::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'std::vector::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'std::vector::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'std::vector::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'std::vector::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0c40f8641ff4ca47fe2998a46404cf37',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a191d1d95c2d102dc1057677df000aaec',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a047d2b3433747276ee6daa9eba154295',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adb80cc201b9b5b821e8ef73492106db3',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aae182defe617c8d37e27b27b09277ea9',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3eb7753105411145e2d8476cf300b348',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a01d23be5cd83c13117d269bc1df1488f',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae4f015606d8e138c72eb87ce5f89ed50',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const_iterator __hint, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a047d2b3433747276ee6daa9eba154295',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adb80cc201b9b5b821e8ef73492106db3',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aae182defe617c8d37e27b27b09277ea9',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(_Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3eb7753105411145e2d8476cf300b348',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const_iterator __hint, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a01d23be5cd83c13117d269bc1df1488f',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const_iterator __hint, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae4f015606d8e138c72eb87ce5f89ed50',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::insert(const_iterator __hint, _Pair &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< __diff_type >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< __diff_type >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< __diff_type >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< __diff_type >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< __diff_type >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _CharClassT >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _CharClassT >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _CharClassT >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _CharClassT >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _CharClassT >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _CharT >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _CharT >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _CharT >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _CharT >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _CharT >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _Cmpt >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _Cmpt >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _Cmpt >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _Cmpt >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _Cmpt >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _Node *, _Nodeptr_Alloc >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _Node *, _Nodeptr_Alloc >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _Node *, _Nodeptr_Alloc >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _Node *, _Nodeptr_Alloc >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _Node *, _Nodeptr_Alloc >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _RealType >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _RealType >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _RealType >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _RealType >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _RealType >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _State< _TraitsT::char_type > >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _State< _TraitsT::char_type > >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _State< _TraitsT::char_type > >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _State< _TraitsT::char_type > >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _State< _TraitsT::char_type > >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< _StringT >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< _StringT >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< _StringT >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< _StringT >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< _StringT >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< block_type, allocator_type >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< block_type, allocator_type >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< block_type, allocator_type >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< block_type, allocator_type >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< block_type, allocator_type >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< Catalog_info * >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< Catalog_info * >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< Catalog_info * >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< Catalog_info * >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< Catalog_info * >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< double >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< double >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< double >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< double >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< double >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< int >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< int >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< int >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< int >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< int >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< result_type >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< result_type >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< result_type >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< result_type >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< result_type >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< size_t >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< size_t >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< size_t >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< size_t >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< size_t >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< std::pair< _BiIter, int > >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< std::pair< _BiIter, int > >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< std::pair< _BiIter, int > >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< std::pair< _BiIter, int > >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< std::pair< _BiIter, int > >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< std::pair< _StateIdT, std::vector > >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< std::pair< _StateIdT, std::vector > >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< std::pair< _StateIdT, std::vector > >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< std::pair< _StateIdT, std::vector > >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< std::pair< _StateIdT, std::vector > >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< std::pair< _StrTransT, _StrTransT > >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< std::pair< _StrTransT, _StrTransT > >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< std::pair< _StrTransT, _StrTransT > >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< std::pair< _StrTransT, _StrTransT > >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< std::pair< _StrTransT, _StrTransT > >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< sub_match< _Bi_iter >, _Alloc >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< sub_match< _Bi_iter >, _Alloc >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< sub_match< _Bi_iter >, _Alloc >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< sub_match< _Bi_iter >, _Alloc >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< sub_match< _Bi_iter >, _Alloc >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ace70e223402de9cdd87a09bd4ff0e76b',1,'vector< sub_match< _BiIter >, _Alloc >::insert(const_iterator __position, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a84793dbae69ddcd84cc26199e6a9e898',1,'vector< sub_match< _BiIter >, _Alloc >::insert(const_iterator __position, value_type &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a1db200194fca60d689aacce652d616',1,'vector< sub_match< _BiIter >, _Alloc >::insert(const_iterator __position, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4922c571c2d3e9006f68813656f36587',1,'vector< sub_match< _BiIter >, _Alloc >::insert(const_iterator __position, size_type __n, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a35cc226f8730266ed04ca5dd0fd3077c',1,'vector< sub_match< _BiIter >, _Alloc >::insert(const_iterator __position, _InputIterator __first, _InputIterator __last)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aae45e3b5fec7f6a0cdd10eec7c6d3666',1,'Eigen::SparseMatrix::insert()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aae45e3b5fec7f6a0cdd10eec7c6d3666',1,'SparseMatrix< Scalar >::insert()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aae45e3b5fec7f6a0cdd10eec7c6d3666',1,'SparseMatrix< Scalar, ColMajor, int >::insert()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aae45e3b5fec7f6a0cdd10eec7c6d3666',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::insert()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aae45e3b5fec7f6a0cdd10eec7c6d3666',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::insert()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aeb86e8478e20d95970a8b61ff01dce3b.html#aeb86e8478e20d95970a8b61ff01dce3b',1,'nlohmann::basic_json::insert(const_iterator pos, const basic_json &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9c5b9de8a4a759861cb600b38a6c81b1.html#a9c5b9de8a4a759861cb600b38a6c81b1',1,'nlohmann::basic_json::insert(const_iterator pos, basic_json &&val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a71e197e6cc78c3960011f68a75f8ef22.html#a71e197e6cc78c3960011f68a75f8ef22',1,'nlohmann::basic_json::insert(const_iterator pos, size_type cnt, const basic_json &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a8137d5471edcd71606e42155ed9c23e2.html#a8137d5471edcd71606e42155ed9c23e2',1,'nlohmann::basic_json::insert(const_iterator pos, const_iterator first, const_iterator last)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a856b8764efd21dac4205a00fec82e09a.html#a856b8764efd21dac4205a00fec82e09a',1,'nlohmann::basic_json::insert(const_iterator pos, initializer_list_t ilist)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0181d03c6314bedcbad2e92d3676223c.html#a0181d03c6314bedcbad2e92d3676223c',1,'nlohmann::basic_json::insert(const_iterator first, const_iterator last)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a0241433138719e477a3cbb0c4cf0a243.html#a0241433138719e477a3cbb0c4cf0a243',1,'nlohmann::ordered_map::insert(const value_type &value)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a2c8509f72bc33307661f1a0ed5763f9e.html#a2c8509f72bc33307661f1a0ed5763f9e',1,'nlohmann::ordered_map::insert(InputIt first, InputIt last)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a48eceff729b80f3f4a023b737efccc5b.html#a48eceff729b80f3f4a023b737efccc5b',1,'nlohmann::ordered_map::insert(value_type &&value)']]], + ['insert_5fafter_382',['insert_after',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a6f8e1063932912fb3e245b7c8116ed1f',1,'std::forward_list::insert_after(const_iterator __pos, const _Tp &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a4921af283fd230d563266ca0ce14a455',1,'std::forward_list::insert_after(const_iterator __pos, size_type __n, const _Tp &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a03cc027e568ad94dbbbc25da7d485fe7',1,'std::forward_list::insert_after(const_iterator __pos, _InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a9739cbb5af18ac9976288f6c9c072bb0',1,'std::forward_list::insert_after(const_iterator __pos, std::initializer_list< _Tp > __il)']]], + ['insert_5ferror_383',['insert_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11131.html',1,'__gnu_pbds']]], + ['insert_5fiterator_384',['insert_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html',1,'std::insert_iterator< _Container >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a69916dd7c180bcb5fb6874adaaacc08b',1,'std::insert_iterator::insert_iterator()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab5c8034e997c5b852b92bdc6a3f70994.html#ab5c8034e997c5b852b92bdc6a3f70994',1,'nlohmann::basic_json::insert_iterator()']]], + ['insert_5fjoin_5ffn_5fimps_2ehpp_385',['insert_join_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01373.html',1,'']]], + ['insertchannel_386',['insertChannel',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1d4bd886d35b00ec0b764cb4ce6eb515',1,'cv::insertChannel()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1d4bd886d35b00ec0b764cb4ce6eb515',1,'insertChannel()(Global Namespace)']]], + ['inserter_387',['inserter',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga289787d62ed6190c55ce9f2ea65aaa41',1,'std::inserter()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga289787d62ed6190c55ce9f2ea65aaa41',1,'inserter()(Global Namespace)']]], + ['inside_388',['inside',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a48aaacb8db7971b6c42fa2d6717d12eb',1,'cv::Point_::inside()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a48aaacb8db7971b6c42fa2d6717d12eb',1,'Point_< double >::inside()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a48aaacb8db7971b6c42fa2d6717d12eb',1,'Point_< float >::inside()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a48aaacb8db7971b6c42fa2d6717d12eb',1,'Point_< int >::inside()']]], + ['inside_20eigen_20on_20a_20simple_20example_389',['What happens inside Eigen, on a simple example',['https://eigen.tuxfamily.org/dox/TopicInsideEigenExample.html',1,'']]], + ['inside_20the_20microsoft_20visual_20studio_390',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['inside_5fmap_391',['INSIDE_MAP',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ab25ab28a95a47dd9cd9e26e71398dd3fa5f72e3ef09a40bb337ce1729a5df2767',1,'cv::FileStorage']]], + ['inspired_20vision_20models_20and_20derivated_20tools_392',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], + ['install_20opencv_20python_20in_20fedora_393',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], + ['install_20opencv_20python_20in_20ubuntu_394',['Install OpenCV-Python in Ubuntu',['https://docs.opencv.org/4.2.0/d2/de6/tutorial_py_setup_in_ubuntu.html',1,'']]], + ['install_20opencv_20python_20in_20windows_395',['Install OpenCV-Python in Windows',['https://docs.opencv.org/4.2.0/d5/de5/tutorial_py_setup_in_windows.html',1,'']]], + ['install_5ftesseract_2emarkdown_396',['install_tesseract.markdown',['https://docs.opencv.org/4.2.0/de/d5b/install__tesseract_8markdown.html',1,'']]], + ['installation_397',['SFM module installation',['https://docs.opencv.org/4.2.0/db/db8/tutorial_sfm_installation.html',1,'']]], + ['installation_20by_20using_20git_20bash_20version_202_2014_201_20and_20cmake_20version_203_209_201_398',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['installation_20in_20ios_399',['Installation in iOS',['https://docs.opencv.org/4.2.0/d5/da3/tutorial_ios_install.html',1,'']]], + ['installation_20in_20linux_400',['Installation in Linux',['https://docs.opencv.org/4.2.0/d7/d9f/tutorial_linux_install.html',1,'']]], + ['installation_20in_20macos_401',['Installation in MacOS',['https://docs.opencv.org/4.2.0/d0/db2/tutorial_macos_install.html',1,'']]], + ['installation_20in_20windows_402',['Installation in Windows',['https://docs.opencv.org/4.2.0/d3/d52/tutorial_windows_install.html',1,'']]], + ['instrnode_403',['InstrNode',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#af24d8c0b3b5a29011882e54fdbf153a2',1,'cv::instr']]], + ['instrumentation_2ehpp_404',['instrumentation.hpp',['https://docs.opencv.org/4.2.0/df/dab/instrumentation_8hpp.html',1,'']]], + ['int_405',['INT',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a7cc4b29d55327b449bfe110b7e8cb327',1,'cv::FileNode::INT'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa53f93baa3057821107c750323892fa92',1,'INT(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa53f93baa3057821107c750323892fa92',1,'INT(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa53f93baa3057821107c750323892fa92',1,'INT(Global Namespace)']]], + ['int16_5ft_406',['int16_t',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#af4c7df4eb83784f8746e143ee9792ad4',1,'cv']]], + ['int2type_407',['Int2Type',['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1cudev_1_1Int2Type.html',1,'cv::cudev']]], + ['int32_5ft_408',['int32_t',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#ad5ed0491058a71efd30a0f28ad1d3f05',1,'cv']]], + ['int64_409',['int64',['https://docs.opencv.org/4.2.0/d1/d1b/group__core__hal__interface.html#ga7cde0074dfd288f2d70c0e035dacb28a',1,]]], + ['int64_5ft_410',['int64_t',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a206f22cea0deff11cbac113b87afff00',1,'cv']]], + ['int8_5ft_411',['int8_t',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a2666d39ccd0946dda42b71153ef88bcb',1,'cv']]], + ['int_5ftype_412',['int_type',['https://docs.opencv.org/4.2.0/d5/d9e/structcv_1_1V__TypeTraits_3_01double_01_4.html#ab4852bea73da351715c4b9200e7dbed4',1,'cv::V_TypeTraits< double >::int_type'],['https://docs.opencv.org/4.2.0/da/d19/structcv_1_1V__TypeTraits_3_01float_01_4.html#ac8f0f98fd7307f571d4ff79354164f08',1,'cv::V_TypeTraits< float >::int_type'],['https://docs.opencv.org/4.2.0/db/d59/structcv_1_1V__TypeTraits_3_01int64_01_4.html#a0ee2ebea3ba6ed36f96b6c3571c8e1f1',1,'cv::V_TypeTraits< int64 >::int_type'],['https://docs.opencv.org/4.2.0/d0/d9d/structcv_1_1V__TypeTraits_3_01schar_01_4.html#a4cd5cf0766decd547dd4a6a814c1c190',1,'cv::V_TypeTraits< schar >::int_type'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1V__TypeTraits_3_01short_01_4.html#a733cd51b950a427e20c62e648542c92e',1,'cv::V_TypeTraits< short >::int_type'],['https://docs.opencv.org/4.2.0/dd/d1d/structcv_1_1V__TypeTraits_3_01uchar_01_4.html#a7f35670c4800371949376b04741edb67',1,'cv::V_TypeTraits< uchar >::int_type'],['https://docs.opencv.org/4.2.0/d2/d4d/structcv_1_1V__TypeTraits_3_01uint64_01_4.html#a45708076798fd9ad8f8b36287549bd92',1,'cv::V_TypeTraits< uint64 >::int_type'],['https://docs.opencv.org/4.2.0/d3/d8c/structcv_1_1V__TypeTraits_3_01unsigned_01_4.html#aa7f271f65ab399cc17e53a94ad5077e2',1,'cv::V_TypeTraits< unsigned >::int_type'],['https://docs.opencv.org/4.2.0/d6/dd5/structcv_1_1V__TypeTraits_3_01ushort_01_4.html#a8d034ede6d35ff487c59a74a0420f401',1,'cv::V_TypeTraits< ushort >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#abed08c42ca8297417265888a1232709a',1,'basic_ios< char, _Traits >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#abed08c42ca8297417265888a1232709a',1,'basic_ios< char, _Traits >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'basic_streambuf< _Elem, _Tr >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'basic_streambuf< _Elem, _Tr >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'basic_streambuf< char, _Traits >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'basic_streambuf< char, _Traits >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'basic_streambuf< char, char_traits< char > >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'basic_streambuf< char, char_traits< char > >::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#abed08c42ca8297417265888a1232709a',1,'std::basic_ios::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#abed08c42ca8297417265888a1232709a',1,'std::basic_ios::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'std::basic_streambuf::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'std::basic_streambuf::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#afb6691f43e173e47ffe52e245a360da1',1,'std::istreambuf_iterator::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#afb6691f43e173e47ffe52e245a360da1',1,'std::istreambuf_iterator::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'std::wbuffer_convert::int_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a1c1565d5b66e703de4d9a8aef4957a8b',1,'std::wbuffer_convert::int_type']]], + ['integer_5fsequence_413',['integer_sequence',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04607.html',1,'std']]], + ['integerareainterptr_414',['IntegerAreaInterPtr',['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html',1,'cv::cudev']]], + ['integerareainterptrsz_415',['IntegerAreaInterPtrSz',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1cudev_1_1IntegerAreaInterPtrSz.html',1,'cv::cudev']]], + ['integral_416',['integral',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gadeaf38d7701d7ad371278d663c50c77d',1,'cv::integral(InputArray src, OutputArray sum, int sdepth=-1)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga8408f27268badd5478b9d3e39124d645',1,'cv::integral(InputArray src, OutputArray sum, OutputArray sqsum, int sdepth=-1, int sqdepth=-1)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga97b87bec26908237e8ba0f6e96d23e28',1,'cv::integral(InputArray src, OutputArray sum, OutputArray sqsum, OutputArray tilted, int sdepth=-1, int sqdepth=-1)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga07e5104eba4bf45212ac9dbc5bf72ba6',1,'cv::cuda::integral()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga9e3e85496c0c314bbb60fabf8eb09c0a',1,'cv::gapi::integral()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga78d53bcbe1710d0f7034e89fd0d43259',1,'cv::hal::integral()'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gadeaf38d7701d7ad371278d663c50c77d',1,'integral(InputArray src, OutputArray sum, int sdepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga8408f27268badd5478b9d3e39124d645',1,'integral(InputArray src, OutputArray sum, OutputArray sqsum, int sdepth=-1, int sqdepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga97b87bec26908237e8ba0f6e96d23e28',1,'integral(InputArray src, OutputArray sum, OutputArray sqsum, OutputArray tilted, int sdepth=-1, int sqdepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga78d53bcbe1710d0f7034e89fd0d43259',1,'integral(int depth, int sdepth, int sqdepth, const uchar *src, size_t srcstep, uchar *sum, size_t sumstep, uchar *sqsum, size_t sqsumstep, uchar *tilted, size_t tstep, int width, int height, int cn)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga9e3e85496c0c314bbb60fabf8eb09c0a',1,'integral(const GMat &src, int sdepth=-1, int sqdepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga07e5104eba4bf45212ac9dbc5bf72ba6',1,'integral(InputArray src, OutputArray sum, Stream &stream=Stream::Null())(Global Namespace)']]], + ['integral_2ehpp_417',['integral.hpp',['https://docs.opencv.org/4.2.0/d3/da8/integral_8hpp.html',1,'']]], + ['integral_5f_418',['integral_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23434664a9bd9d559afc5f51e1378d50',1,'cv::cudev::integral_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23434664a9bd9d559afc5f51e1378d50',1,'integral_()(Global Namespace)']]], + ['integral_5fconstant_419',['integral_constant',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'std']]], + ['integral_5fconstant_3c_20bool_2c_20_21ratio_5fequal_3c_20_5fr1_2c_20_5fr2_20_3e_3a_3avalue_20_3e_420',['integral_constant< bool, !ratio_equal< _R1, _R2 >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fbig_5fless_3c_20_5fleft_3a_3a_5f_5fhi_2c_20_5fleft_3a_3a_5f_5flo_2c_20_5fright_3a_3a_5f_5fhi_2c_20_5fright_3a_3a_5f_5flo_20_3e_3a_3avalue_20_3e_421',['integral_constant< bool, __big_less< _Left::__hi, _Left::__lo, _Right::__hi, _Right::__lo >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fhas_5fvirtual_5fdestructor_28_5ftp_29_3e_422',['integral_constant< bool, __has_virtual_destructor(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fabstract_28_5ftp_29_3e_423',['integral_constant< bool, __is_abstract(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fbase_5fof_28_5fbase_2c_20_5fderived_29_3e_424',['integral_constant< bool, __is_base_of(_Base, _Derived)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fclass_28_5ftp_29_3e_425',['integral_constant< bool, __is_class(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fempty_28_5ftp_29_3e_426',['integral_constant< bool, __is_empty(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fenum_28_5ftp_29_3e_427',['integral_constant< bool, __is_enum(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5ffinal_28_5ftp_29_3e_428',['integral_constant< bool, __is_final(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fliteral_5ftype_28_5ftp_29_3e_429',['integral_constant< bool, __is_literal_type(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fpod_28_5ftp_29_3e_430',['integral_constant< bool, __is_pod(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fpolymorphic_28_5ftp_29_3e_431',['integral_constant< bool, __is_polymorphic(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5fstandard_5flayout_28_5ftp_29_3e_432',['integral_constant< bool, __is_standard_layout(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5ftrivial_28_5ftp_29_3e_433',['integral_constant< bool, __is_trivial(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5ftrivially_5fcopyable_28_5ftp_29_3e_434',['integral_constant< bool, __is_trivially_copyable(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5f_5fis_5funion_28_5ftp_29_3e_435',['integral_constant< bool, __is_union(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20_5fr1_3a_3anum_3d_3d_5fr2_3a_3anum_20_26_26_5fr1_3a_3aden_3d_3d_5fr2_3a_3aden_20_3e_436',['integral_constant< bool, _R1::num==_R2::num &&_R1::den==_R2::den >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20noexcept_28_5ftp_28_29_29_3e_437',['integral_constant< bool, noexcept(_Tp())>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20noexcept_28_5ftp_28declval_3c_20_5fargs_20_3e_28_29_2e_2e_2e_29_29_3e_438',['integral_constant< bool, noexcept(_Tp(declval< _Args >()...))>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20noexcept_28declval_3c_20_5ftp_20_3e_28_29_3ddeclval_3c_20_5fup_20_3e_28_29_29_3e_439',['integral_constant< bool, noexcept(declval< _Tp >()=declval< _Up >())>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_20noexcept_28static_5fcast_3c_20_5ftp_20_3e_28declval_3c_20_5farg_20_3e_28_29_29_29_3e_440',['integral_constant< bool, noexcept(static_cast< _Tp >(declval< _Arg >()))>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_28_5f_5fhi1_3c_20_5f_5fhi2_7c_7c_28_5f_5fhi1_3d_3d_5f_5fhi2_20_26_26_5f_5flo1_3c_20_5f_5flo2_29_29_3e_441',['integral_constant< bool,(__hi1< __hi2||(__hi1==__hi2 &&__lo1< __lo2))>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20bool_2c_28extent_3c_20_5ftp_20_3e_3a_3avalue_20_3e_200_29_3e_442',['integral_constant< bool,(extent< _Tp >::value > 0)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20int_2c_200_20_3e_443',['integral_constant< int, 0 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20int_2c_20_5fnum_20_3e_444',['integral_constant< int, _Num >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20intmax_5ft_2c_20_5f_5fstatic_5fabs_3c_20_5fpn_20_3e_3a_3avalue_20_3e_445',['integral_constant< intmax_t, __static_abs< _Pn >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20intmax_5ft_2c_20_5f_5fstatic_5fabs_3c_20_5fqn_20_3e_3a_3avalue_20_3e_446',['integral_constant< intmax_t, __static_abs< _Qn >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20intmax_5ft_2c_20_5fpn_20_2a_5f_5fstatic_5fsign_3c_20_5fpn_20_3e_3a_3avalue_20_3e_447',['integral_constant< intmax_t, _Pn *__static_sign< _Pn >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20intmax_5ft_2c_28_5fpn_3c_200_29_20_3f_20_2d1_20_3a1_20_3e_448',['integral_constant< intmax_t,(_Pn< 0) ? -1 :1 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20size_5ft_2c_201_20_3e_449',['integral_constant< size_t, 1 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_200_20_3e_450',['integral_constant< std::size_t, 0 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_201_2brank_3c_20_5ftp_20_3e_3a_3avalue_20_3e_451',['integral_constant< std::size_t, 1+rank< _Tp >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_202_20_3e_452',['integral_constant< std::size_t, 2 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_20_5fnm_20_3e_453',['integral_constant< std::size_t, _Nm >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_20_5fuint_3d_3d0_20_3f_200_20_3aextent_3c_20_5ftp_2c_20_5fuint_20_2d_201_20_3e_3a_3avalue_20_3e_454',['integral_constant< std::size_t, _Uint==0 ? 0 :extent< _Tp, _Uint - 1 >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_20_5fuint_3d_3d0_20_3f_20_5fsize_20_3aextent_3c_20_5ftp_2c_20_5fuint_20_2d_201_20_3e_3a_3avalue_20_3e_455',['integral_constant< std::size_t, _Uint==0 ? _Size :extent< _Tp, _Uint - 1 >::value >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_20alignof_28_5ftp_29_3e_456',['integral_constant< std::size_t, alignof(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20std_3a_3asize_5ft_2c_20sizeof_2e_2e_2e_28_5felements_29_3e_457',['integral_constant< std::size_t, sizeof...(_Elements)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20unsigned_2c_200_20_3e_458',['integral_constant< unsigned, 0 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20unsigned_2c_201_20_3e_459',['integral_constant< unsigned, 1 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integral_5fconstant_3c_20unsigned_2c_20_5fval_20_3e_460',['integral_constant< unsigned, _Val >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03055.html',1,'']]], + ['integralbody_461',['IntegralBody',['https://docs.opencv.org/4.2.0/d3/dde/structcv_1_1cudev_1_1IntegralBody.html',1,'cv::cudev']]], + ['integralhistogram_462',['integralHistogram',['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#aa8e94e11f6fe981c73a87a929f0e8824',1,'cv::CvHOGEvaluator']]], + ['integralimage_463',['integralImage',['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#a45be5fa84252fa4ef57a91bb84eae158',1,'cv::stereo::MVKernel']]], + ['integrated_464',['integrated',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#aace1742c04682d70838d30cdd6ef1927',1,'cv::cuda::DeviceInfo']]], + ['intel®_20mkl_20from_20eigen_465',['Using Intel® MKL from Eigen',['https://eigen.tuxfamily.org/dox/TopicUsingIntelMKL.html',1,'']]], + ['intel_20ipp_20asynchronous_20c_20c_20converters_466',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], + ['intel_20perceptual_20computing_20sdk_20compatible_20depth_20sensors_467',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], + ['intel_20va_20api_20opencl_20cl_20va_20interoperability_468',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], + ['intelperc_2emarkdown_469',['intelperc.markdown',['https://docs.opencv.org/4.2.0/d8/d80/intelperc_8markdown.html',1,'']]], + ['intelsubgroupssupport_470',['intelSubgroupsSupport',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a44ef751bc23e21d77a46f5985fca42dc',1,'cv::ocl::Device']]], + ['intensor_471',['inTensor',['https://docs.opencv.org/4.2.0/de/d5f/structcv_1_1GPlaidMLContext.html#a825fcbb4787de7de40e29a083e808c46',1,'cv::GPlaidMLContext']]], + ['inter_472',['INTER',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56a9dec0ceda288deaa617c4c65c88852ae',1,'cv::ml::SVM']]], + ['inter_5farea_473',['INTER_AREA',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121acf959dca2480cc694ca016b81b442ceb',1,'cv::INTER_AREA'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121acf959dca2480cc694ca016b81b442ceb',1,'INTER_AREA(Global Namespace)']]], + ['inter_5fbits_474',['INTER_BITS',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daea9ce4fddaf7714ea113a8a086d1d4b7f9',1,'cv::INTER_BITS'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daea9ce4fddaf7714ea113a8a086d1d4b7f9',1,'INTER_BITS(Global Namespace)']]], + ['inter_5fbits2_475',['INTER_BITS2',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daea5d3f110270a147224feaabac0c7a480b',1,'cv::INTER_BITS2'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daea5d3f110270a147224feaabac0c7a480b',1,'INTER_BITS2(Global Namespace)']]], + ['inter_5fcubic_476',['INTER_CUBIC',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121a55e404e7fa9684af79fe9827f36a5dc1',1,'cv::INTER_CUBIC'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121a55e404e7fa9684af79fe9827f36a5dc1',1,'INTER_CUBIC(Global Namespace)']]], + ['inter_5flanczos4_477',['INTER_LANCZOS4',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121ac6c578caa97f2d00f82bac879cf3c781',1,'cv::INTER_LANCZOS4'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121ac6c578caa97f2d00f82bac879cf3c781',1,'INTER_LANCZOS4(Global Namespace)']]], + ['inter_5flinear_478',['INTER_LINEAR',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121ac97d8e4880d8b5d509e96825c7522deb',1,'cv::INTER_LINEAR'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121ac97d8e4880d8b5d509e96825c7522deb',1,'INTER_LINEAR(Global Namespace)']]], + ['inter_5flinear_5fexact_479',['INTER_LINEAR_EXACT',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121ac00f4a8155563cdc23437fc0959da935',1,'cv::INTER_LINEAR_EXACT'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121ac00f4a8155563cdc23437fc0959da935',1,'INTER_LINEAR_EXACT(Global Namespace)']]], + ['inter_5fmax_480',['INTER_MAX',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121a49bb9f818707a31ae1f19158b60f7112',1,'cv::INTER_MAX'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121a49bb9f818707a31ae1f19158b60f7112',1,'INTER_MAX(Global Namespace)']]], + ['inter_5fnearest_481',['INTER_NEAREST',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121aa5521d8e080972c762467c45f3b70e6c',1,'cv::INTER_NEAREST'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga5bb5a1fea74ea38e1a5445ca803ff121aa5521d8e080972c762467c45f3b70e6c',1,'INTER_NEAREST(Global Namespace)']]], + ['inter_5ftab_5fsize_482',['INTER_TAB_SIZE',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daea2dee31b51b2c400c35a31bf24f8cd809',1,'cv::INTER_TAB_SIZE'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daea2dee31b51b2c400c35a31bf24f8cd809',1,'INTER_TAB_SIZE(Global Namespace)']]], + ['inter_5ftab_5fsize2_483',['INTER_TAB_SIZE2',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daeabdbe1089b768d20af013c344bcac74cf',1,'cv::INTER_TAB_SIZE2'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gga628d8c499433359d67b1d830d46d8daeabdbe1089b768d20af013c344bcac74cf',1,'INTER_TAB_SIZE2(Global Namespace)']]], + ['interactive_20camera_20calibration_20application_484',['Interactive camera calibration application',['https://docs.opencv.org/4.2.0/d7/d21/tutorial_interactive_calibration.html',1,'']]], + ['interactive_20foreground_20extraction_20using_20grabcut_20algorithm_485',['Interactive Foreground Extraction using GrabCut Algorithm',['https://docs.opencv.org/4.2.0/d8/d83/tutorial_py_grabcut.html',1,'']]], + ['interactive_20visual_20debugging_20of_20computer_20vision_20applications_486',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], + ['interactive_20visual_20debugging_20of_20computer_20vision_20programs_487',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], + ['interactive_5fcalibration_2emarkdown_488',['interactive_calibration.markdown',['https://docs.opencv.org/4.2.0/df/dc3/interactive__calibration_8markdown.html',1,'']]], + ['interactive_5fface_5fdetection_2emarkdown_489',['interactive_face_detection.markdown',['https://docs.opencv.org/4.2.0/d7/dda/interactive__face__detection_8markdown.html',1,'']]], + ['interarea_490',['interArea',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf033166d7ad42d8500efe06c26d98db3',1,'cv::cudev::interArea(const SrcPtr &src, Size areaSize)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d48e7e2175b23c83376184ddab4e1d',1,'cv::cudev::interArea(const SrcPtr &src, Size2f areaSize)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf033166d7ad42d8500efe06c26d98db3',1,'interArea(const SrcPtr &src, Size areaSize)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d48e7e2175b23c83376184ddab4e1d',1,'interArea(const SrcPtr &src, Size2f areaSize)(Global Namespace)']]], + ['intercubic_491',['interCubic',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba564442f7de5286d9627e2ba9dd80c7',1,'cv::cudev::interCubic()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba564442f7de5286d9627e2ba9dd80c7',1,'interCubic(const SrcPtr &src)(Global Namespace)']]], + ['interface_492',['Interface',['https://docs.opencv.org/4.2.0/d1/d1b/group__core__hal__interface.html',1,'Interface'],['https://docs.opencv.org/4.2.0/dd/d8b/group__imgproc__hal__interface.html',1,'Interface'],['https://docs.opencv.org/4.2.0/db/d47/group__features2d__hal__interface.html',1,'Interface']]], + ['interface_2eh_493',['interface.h',['https://docs.opencv.org/4.2.0/d2/d10/core_2include_2opencv2_2core_2hal_2interface_8h.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/d1e/imgproc_2include_2opencv2_2imgproc_2hal_2interface_8h.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0a/features2d_2include_2opencv2_2features2d_2hal_2interface_8h.html',1,'(Global Namespace)']]], + ['interfacing_20with_20raw_20buffers_3a_20the_20map_20class_494',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], + ['interlinear_495',['interLinear',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1dc51dc43ca68f41e9ee5529f7f55f8',1,'cv::cudev::interLinear()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1dc51dc43ca68f41e9ee5529f7f55f8',1,'interLinear()(Global Namespace)']]], + ['internal_496',['internal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'basic_ios< char, _Traits >::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'basic_iostream< char >::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'basic_istream< char >::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'basic_istream< char, _Traits >::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'basic_ostream< char >::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'basic_ostream< char, _Traits >::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_fstream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_ifstream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_ios::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_iostream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_istream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_istringstream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_ofstream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_ostream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_ostringstream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::basic_stringstream::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6e38abfae36f1fce1d01ec47487ba226',1,'std::ios_base::internal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a084be990a1caf21a3b1ce38fe61bad3f',1,'std::internal()']]], + ['internal_3a_3avideocaptureprivateaccessor_497',['VideoCapturePrivateAccessor',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#af1de3913d3e916106e718ebdf190f76e',1,'cv::VideoCapture']]], + ['internearest_498',['interNearest',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad405b90f08a3d8e8e08844f4255a40a7',1,'cv::cudev::interNearest()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad405b90f08a3d8e8e08844f4255a40a7',1,'interNearest(const SrcPtr &src)(Global Namespace)']]], + ['interoperability_499',['interoperability',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html',1,'DirectX interoperability'],['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'Intel VA-API/OpenCL (CL-VA) interoperability'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html',1,'OpenGL interoperability']]], + ['interp_5fepic_500',['INTERP_EPIC',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggac80d2a88890a3d8a1e655c91a24f3225a286254d8895e599c70603e226f2d3026',1,'cv::optflow::INTERP_EPIC'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggac80d2a88890a3d8a1e655c91a24f3225a286254d8895e599c70603e226f2d3026',1,'INTERP_EPIC(Global Namespace)']]], + ['interp_5ffactor_501',['interp_factor',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a2dc7abf68013ae8ee912a4cfdbe8b175',1,'cv::TrackerKCF::Params']]], + ['interp_5fgeo_502',['INTERP_GEO',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggac80d2a88890a3d8a1e655c91a24f3225adbe6372a8510a26dae909fd9e5acfacb',1,'cv::optflow::INTERP_GEO'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggac80d2a88890a3d8a1e655c91a24f3225adbe6372a8510a26dae909fd9e5acfacb',1,'INTERP_GEO(Global Namespace)']]], + ['interp_5fric_503',['INTERP_RIC',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggac80d2a88890a3d8a1e655c91a24f3225a7c079638b5150b20bdf5fb2a0acf5f15',1,'cv::optflow::INTERP_RIC'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggac80d2a88890a3d8a1e655c91a24f3225a7c079638b5150b20bdf5fb2a0acf5f15',1,'INTERP_RIC(Global Namespace)']]], + ['interplayer_504',['InterpLayer',['https://docs.opencv.org/4.2.0/de/d56/classcv_1_1dnn_1_1InterpLayer.html',1,'cv::dnn']]], + ['interpolate_505',['interpolate',['https://docs.opencv.org/4.2.0/d4/da8/classcv_1_1ximgproc_1_1SparseMatchInterpolator.html#a73934acbb2ef74b683c67cb765df1e0c',1,'cv::ximgproc::SparseMatchInterpolator']]], + ['interpolatecornerscharuco_506',['interpolateCornersCharuco',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gadcc5dc30c9ad33dcf839e84e8638dcd1',1,'cv::aruco::interpolateCornersCharuco()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gadcc5dc30c9ad33dcf839e84e8638dcd1',1,'interpolateCornersCharuco()(Global Namespace)']]], + ['interpolateframes_507',['interpolateFrames',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga03c554591bbb19e09624feb188525256',1,'cv::cuda::interpolateFrames()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga03c554591bbb19e09624feb188525256',1,'interpolateFrames(const GpuMat &frame0, const GpuMat &frame1, const GpuMat &fu, const GpuMat &fv, const GpuMat &bu, const GpuMat &bv, float pos, GpuMat &newFrame, GpuMat &buf, Stream &stream=Stream::Null())(Global Namespace)']]], + ['interpolation_2ehpp_508',['interpolation.hpp',['https://docs.opencv.org/4.2.0/d8/d8e/interpolation_8hpp.html',1,'']]], + ['interpolationflags_509',['InterpolationFlags',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga5bb5a1fea74ea38e1a5445ca803ff121',1,'cv::InterpolationFlags'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga5bb5a1fea74ea38e1a5445ca803ff121',1,'InterpolationFlags(Global Namespace)']]], + ['interpolationflags_510',['interpolationFlags',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#abc0c8f54a1d223a1098206654813d973',1,'cv::Stitcher']]], + ['interpolationmasks_511',['InterpolationMasks',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga628d8c499433359d67b1d830d46d8dae',1,'cv::InterpolationMasks'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga628d8c499433359d67b1d830d46d8dae',1,'InterpolationMasks(Global Namespace)']]], + ['interpolationtype_512',['InterpolationType',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gac80d2a88890a3d8a1e655c91a24f3225',1,'cv::optflow::InterpolationType'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gac80d2a88890a3d8a1e655c91a24f3225',1,'InterpolationType(Global Namespace)']]], + ['interprocess_513',['INTERPROCESS',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa912544338415c5f8c8e55e85a139bfbacf33d3d39ba006045591a2b297fb8c8b',1,'cv::cuda::Event']]], + ['intersect_5ffull_514',['INTERSECT_FULL',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaaf0eb9e10bd5adcbd446cd31fea2db68a56ab9c9ae145e505676ed8a6d90e032d',1,'cv::INTERSECT_FULL'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaaf0eb9e10bd5adcbd446cd31fea2db68a56ab9c9ae145e505676ed8a6d90e032d',1,'INTERSECT_FULL(Global Namespace)']]], + ['intersect_5fnone_515',['INTERSECT_NONE',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaaf0eb9e10bd5adcbd446cd31fea2db68a0499e05c23055c4b362b7c203ce06ea3',1,'cv::INTERSECT_NONE'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaaf0eb9e10bd5adcbd446cd31fea2db68a0499e05c23055c4b362b7c203ce06ea3',1,'INTERSECT_NONE(Global Namespace)']]], + ['intersect_5fpartial_516',['INTERSECT_PARTIAL',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaaf0eb9e10bd5adcbd446cd31fea2db68aba404626c7adb5e8b352a17be236a251',1,'cv::INTERSECT_PARTIAL'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaaf0eb9e10bd5adcbd446cd31fea2db68aba404626c7adb5e8b352a17be236a251',1,'INTERSECT_PARTIAL(Global Namespace)']]], + ['intersectconvexconvex_517',['intersectConvexConvex',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8e840f3f3695613d32c052bec89e782c',1,'cv::intersectConvexConvex()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8e840f3f3695613d32c052bec89e782c',1,'intersectConvexConvex()(Global Namespace)']]], + ['intersection_518',['intersection',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ad3d947d3e32b1521bb1ccd9eab4c46cb',1,'Eigen::AlignedBox::intersection()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a308d9231ca5a0ebffde94fb13fd9916a',1,'Eigen::Hyperplane::intersection()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a980dc8dc59ea6de2fb496055181a1d08',1,'Eigen::ParametrizedLine::intersection()']]], + ['intersection_5fover_5funion_519',['intersection_over_union',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#addf33c7ccf2d69158f9e863b99b99581',1,'cv::dnn_objdetect::InferBbox']]], + ['intersectionparameter_520',['intersectionParameter',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#af1d5100ee79a651e97ef716ad1af2ebe',1,'Eigen::ParametrizedLine']]], + ['intersectionpoint_521',['intersectionPoint',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a0ebbede4dd8f60da43128af9aabf0ead',1,'Eigen::ParametrizedLine']]], + ['intersects_522',['intersects',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a0bdea9a9410af7ad6f63ce71a2f59443',1,'Eigen::AlignedBox']]], + ['intervals_523',['intervals',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#acfc8ae5b0585354104c28233a1fad259',1,'std::piecewise_constant_distribution::intervals()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#aaf12335330484efaa86125c3ea3819c4',1,'std::piecewise_linear_distribution::intervals()']]], + ['intl_524',['intl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#aff5d9072376fa96a1b7f166151d32af5',1,'std::moneypunct']]], + ['into_20android_20development_525',['Introduction into Android Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'']]], + ['intr_526',['intr',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a1d6daf719153457cad9fe220f9120c92',1,'cv::dynafu::Params::intr'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a42e00e02b2cf33ffb8f68eefd5c2bf0a',1,'cv::kinfu::Params::intr']]], + ['intrin_2ehpp_527',['intrin.hpp',['https://docs.opencv.org/4.2.0/df/db4/intrin_8hpp.html',1,'']]], + ['intrin_5favx_2ehpp_528',['intrin_avx.hpp',['https://docs.opencv.org/4.2.0/d9/dd4/intrin__avx_8hpp.html',1,'']]], + ['intrin_5favx512_2ehpp_529',['intrin_avx512.hpp',['https://docs.opencv.org/4.2.0/d1/dc3/intrin__avx512_8hpp.html',1,'']]], + ['intrin_5fcpp_2ehpp_530',['intrin_cpp.hpp',['https://docs.opencv.org/4.2.0/d1/d94/intrin__cpp_8hpp.html',1,'']]], + ['intrin_5fforward_2ehpp_531',['intrin_forward.hpp',['https://docs.opencv.org/4.2.0/da/daa/intrin__forward_8hpp.html',1,'']]], + ['intrin_5fmsa_2ehpp_532',['intrin_msa.hpp',['https://docs.opencv.org/4.2.0/dd/d08/intrin__msa_8hpp.html',1,'']]], + ['intrin_5fneon_2ehpp_533',['intrin_neon.hpp',['https://docs.opencv.org/4.2.0/dd/d52/intrin__neon_8hpp.html',1,'']]], + ['intrin_5fsse_2ehpp_534',['intrin_sse.hpp',['https://docs.opencv.org/4.2.0/d2/d3c/intrin__sse_8hpp.html',1,'']]], + ['intrin_5fsse_5fem_2ehpp_535',['intrin_sse_em.hpp',['https://docs.opencv.org/4.2.0/d3/d95/intrin__sse__em_8hpp.html',1,'']]], + ['intrin_5fvsx_2ehpp_536',['intrin_vsx.hpp',['https://docs.opencv.org/4.2.0/d3/d96/intrin__vsx_8hpp.html',1,'']]], + ['intrin_5fwasm_2ehpp_537',['intrin_wasm.hpp',['https://docs.opencv.org/4.2.0/de/df3/intrin__wasm_8hpp.html',1,'']]], + ['intrinsic_20parameters_538',['Intrinsic Parameters',['../cameraconfig.html#intrinsic',1,'']]], + ['intrinsicparams_539',['intrinsicParams',['../structcam_1_1CameraConfig.html#aa8cf61c251e969a93facf420ba30e3e2',1,'cam::CameraConfig']]], + ['intrinsics_540',['Universal intrinsics',['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html',1,'']]], + ['intro_2emarkdown_541',['intro.markdown',['https://docs.opencv.org/4.2.0/d0/d2e/intro_8markdown.html',1,'']]], + ['introduction_542',['Introduction',['https://docs.opencv.org/4.2.0/d2/d94/bioinspired_retina.html',1,'Bioinspired Module Retina Introduction'],['https://docs.opencv.org/4.2.0/d2/dbc/cuda_intro.html',1,'CUDA Module Introduction'],['https://docs.opencv.org/4.2.0/d1/dfb/intro.html',1,'Introduction']]], + ['introduction_20into_20android_20development_543',['Introduction into Android Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'']]], + ['introduction_20to_20java_20development_544',['Introduction to Java Development',['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'']]], + ['introduction_20to_20opencv_545',['Introduction to OpenCV',['https://docs.opencv.org/4.2.0/df/d65/tutorial_table_of_content_introduction.html',1,'Introduction to OpenCV'],['https://docs.opencv.org/4.2.0/da/df6/tutorial_py_table_of_contents_setup.html',1,'Introduction to OpenCV']]], + ['introduction_20to_20opencv_20development_20with_20clojure_546',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], + ['introduction_20to_20opencv_20js_547',['Introduction to OpenCV.js',['https://docs.opencv.org/4.2.0/df/df7/tutorial_js_table_of_contents_setup.html',1,'']]], + ['introduction_20to_20opencv_20js_20and_20tutorials_548',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], + ['introduction_20to_20opencv_20python_20tutorials_549',['Introduction to OpenCV-Python Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'']]], + ['introduction_20to_20opencv_20tracker_550',['Introduction to OpenCV Tracker',['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'']]], + ['introduction_20to_20principal_20component_20analysis_20pca_551',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], + ['introduction_20to_20sift_20scale_20invariant_20feature_20transform_552',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], + ['introduction_20to_20support_20vector_20machines_553',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], + ['introduction_20to_20surf_20speeded_20up_20robust_20features_554',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], + ['introduction_5fto_5fpca_2emarkdown_555',['introduction_to_pca.markdown',['https://docs.opencv.org/4.2.0/de/d8a/introduction__to__pca_8markdown.html',1,'']]], + ['introduction_5fto_5fsvm_2emarkdown_556',['introduction_to_svm.markdown',['https://docs.opencv.org/4.2.0/d7/d6d/introduction__to__svm_8markdown.html',1,'']]], + ['inv_557',['inv',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ac4a16f4a77037c883dbbc2a4f617ee4f',1,'cv::Affine3::inv()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ac4a16f4a77037c883dbbc2a4f617ee4f',1,'Affine3< float >::inv()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a039eb3c6740a850696a12519a4b8bfc6',1,'cv::Mat::inv()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6b6f538841a37416d5461f919f5e7bf6',1,'cv::MatExpr::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'cv::Matx::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< _Tp, cn, 1 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, 1, 3 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, 2, 2 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, 2, 3 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, 3, 3 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, 3, 4 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, 4, 4 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< double, cn, 1 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< float, 2, 3 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< float, 3, 3 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< float, cn, 1 >::inv()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6891a002ccb92af0859cf393a25451f4',1,'Matx< float_type, 4, 4 >::inv()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#abb77173e3e661fc3f161f79e5559c5d7',1,'cv::UMat::inv()']]], + ['inval_558',['inVal',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#aa69e3939982302a2bcaf3e8b020b6d4d',1,'cv::GCPUContext::inVal()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a3f4f9a4dbebc501d9bf7c0c23f2c92bf',1,'cv::GOCLContext::inVal()']]], + ['invalid_5fargument_559',['invalid_argument',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02799.html',1,'std']]], + ['invalid_5fcamera_5fconfig_560',['invalid_camera_config',['../classcam_1_1invalid__camera__config.html',1,'cam::invalid_camera_config'],['../classcam_1_1invalid__camera__config.html#ae208195e58e6517792218d583241322d',1,'cam::invalid_camera_config::invalid_camera_config()'],['../classcam_1_1invalid__camera__config.html#a664e017c22cbba50993bbacbb0ff97b6',1,'cam::invalid_camera_config::invalid_camera_config(const std::string &msg)']]], + ['invalid_5fiterator_561',['invalid_iterator',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6ccc9788413fd58de998fe92743cb4aa.html#a6ccc9788413fd58de998fe92743cb4aa',1,'nlohmann::basic_json']]], + ['invalidation_20guarantees_562',['Invalidation Guarantees',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01538.html',1,'']]], + ['invalidinput_563',['InvalidInput',['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea580b2a3cafe585691e789f768fb729bf',1,'Eigen::InvalidInput'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea580b2a3cafe585691e789f768fb729bf',1,'InvalidInput(Global Namespace)']]], + ['invariant_20feature_20transform_564',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], + ['inverse_565',['Inverse',['https://eigen.tuxfamily.org/dox/classEigen_1_1Inverse.html',1,'Eigen']]], + ['inverse_566',['inverse',['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#af01cf54d9e86fe12b41a4b7f70d06c2b',1,'Eigen::AngleAxis::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a31c45402e74774d9cd13af0e57a6b72f',1,'Eigen::ColPivHouseholderQR::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a31c45402e74774d9cd13af0e57a6b72f',1,'ColPivHouseholderQR< MatrixType >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a352ce66397af06da214ddde343cec6f5',1,'Eigen::FullPivHouseholderQR::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#ae6f4bb55f859f6353f99cf15ecff4b25',1,'Eigen::FullPivLU::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#a02014cb7359500d5bd51b6f8ee4d34fc',1,'Eigen::HouseholderSequence::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7712eb69e8ea3c8f7b8da1c44dbdeebf',1,'Eigen::MatrixBase::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7712eb69e8ea3c8f7b8da1c44dbdeebf',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7712eb69e8ea3c8f7b8da1c44dbdeebf',1,'MatrixBase< Solve< Decomposition, RhsType > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#aef983470f92aba829e861e32e68681b5',1,'Eigen::PartialPivLU::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adb9af427f317202366c2832876064eb3',1,'Eigen::PermutationBase::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adb9af427f317202366c2832876064eb3',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adb9af427f317202366c2832876064eb3',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adb9af427f317202366c2832876064eb3',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#adb9af427f317202366c2832876064eb3',1,'PermutationBase< PermutationWrapper< _IndicesType > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ab12ee41b3b06adc3062217a795a6a9f5',1,'Eigen::QuaternionBase::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ab12ee41b3b06adc3062217a795a6a9f5',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ab12ee41b3b06adc3062217a795a6a9f5',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ab12ee41b3b06adc3062217a795a6a9f5',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a5c01f57e3a382c7f677ac9ff3b95aea6',1,'Eigen::Rotation2D::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'Eigen::RotationBase::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'RotationBase< AngleAxis< _Scalar >, 3 >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'RotationBase< Derived, 3 >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a8532fb716ea4267cf8bbdb99e5e54837',1,'RotationBase< Rotation2D< _Scalar >, 2 >::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ab8dbcd157bf194efca1a5413c0945211',1,'Eigen::Transform::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#aa72ee6bccce7f26cbef57550308e6aaf',1,'Eigen::Translation::inverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a60dba22bebe9e2c97cfbc76f85eb1b78',1,'Eigen::UniformScaling::inverse()'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae9de9064c3b832ee804c0e0957e80334',1,'Eigen::inverse()']]], + ['inverse_20square_20root_20calculation_567',['Inverse square root calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'']]], + ['inversearmkinematics_568',['InverseArmKinematics',['../classkinematics_1_1InverseArmKinematics.html',1,'kinematics::InverseArmKinematics< D, N >'],['../classkinematics_1_1InverseArmKinematics.html#aad65afdcfb61a30f8fa7ee851bfc6d10',1,'kinematics::InverseArmKinematics::InverseArmKinematics()']]], + ['inversearmkinematics_3c_202_2c_20n_20_3e_569',['InverseArmKinematics< 2, N >',['../classkinematics_1_1InverseArmKinematics.html',1,'kinematics']]], + ['inversed_570',['inversed',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#afa6f45d243a85f1ee318b95c9c65b4f4',1,'cv::ml::DTrees::Split']]], + ['inversemap_571',['inverseMap',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html#ac1720d6a6875d6c8ef132941dd3dd29a',1,'cv::reg::Map::inverseMap()'],['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#a7912260577af849d886b252850cbcec4',1,'cv::reg::MapAffine::inverseMap()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#ac7b99925455e3f507110aeb51ec8e69d',1,'cv::reg::MapProjec::inverseMap()'],['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html#aadddeaed88de4e9b82d268df5acf0dcf',1,'cv::reg::MapShift::inverseMap()']]], + ['inversewarp_572',['inverseWarp',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html#a8c68ada5f02eff2a48c8b5654ce61ca4',1,'cv::reg::Map::inverseWarp()'],['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#aef18374208fbb6b010b8450036de434f',1,'cv::reg::MapAffine::inverseWarp()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#abb00b486f8d6ead26f153f9ff1802c4f',1,'cv::reg::MapProjec::inverseWarp()'],['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html#ab1c8fe2f73ee20358a5f270537840109',1,'cv::reg::MapShift::inverseWarp()']]], + ['invert_573',['invert',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a33bc65dedc2b1a9b626b277b49493bc0',1,'cv::MatOp::invert()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad278044679d4ecf20f7622cc151aaaa2',1,'cv::invert()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad278044679d4ecf20f7622cc151aaaa2',1,'invert()(Global Namespace)']]], + ['invertaffinetransform_574',['invertAffineTransform',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga57d3505a878a7e1a636645727ca08f51',1,'cv::invertAffineTransform()'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga57d3505a878a7e1a636645727ca08f51',1,'invertAffineTransform()(Global Namespace)']]], + ['invoke_575',['invoke',['https://docs.opencv.org/4.2.0/d5/dd6/structcv_1_1detail_1_1TransHelper_3_01K_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01Out_01_4.html#ad6af4ecc182a5d4beac040ff4c373290',1,'cv::detail::TransHelper< K, std::tuple< Ins... >, Out >']]], + ['invoke_2eh_576',['invoke.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00383.html',1,'']]], + ['invsqrt32f_577',['invSqrt32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae41866c26362d0ee7d48198f7b1215de',1,'cv::hal::invSqrt32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae41866c26362d0ee7d48198f7b1215de',1,'invSqrt32f()(Global Namespace)']]], + ['invsqrt64f_578',['invSqrt64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8eecdda77ea46172be12b2a580eb7a14',1,'cv::hal::invSqrt64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8eecdda77ea46172be12b2a580eb7a14',1,'invSqrt64f(const double *src, double *dst, int len)(Global Namespace)']]], + ['io_2ehpp_579',['io.hpp',['https://docs.opencv.org/4.2.0/d2/dc6/io_8hpp.html',1,'']]], + ['io_5ferrc_580',['io_errc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5a20cae60a4377da46121402c57322a2',1,'std']]], + ['ioformat_581',['IOFormat',['https://eigen.tuxfamily.org/dox/structEigen_1_1IOFormat.html',1,'Eigen::IOFormat'],['https://eigen.tuxfamily.org/dox/structEigen_1_1IOFormat.html#acdcc91702d45c714b11ba42db5beddb5',1,'Eigen::IOFormat::IOFormat()']]], + ['iomanip_582',['iomanip',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00077.html',1,'']]], + ['ios_583',['iOS',['https://docs.opencv.org/4.2.0/d5/da3/tutorial_ios_install.html',1,'Installation in iOS'],['https://docs.opencv.org/4.2.0/d3/dc9/tutorial_table_of_content_ios.html',1,'OpenCV iOS']]], + ['ios_584',['ios',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00080.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gac1665745293037f1d1be9b144f27bc9d',1,'std::ios'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gac1665745293037f1d1be9b144f27bc9d',1,'ios(Global Namespace)']]], + ['ios_20glue_585',['iOS glue',['https://docs.opencv.org/4.2.0/d2/d92/group__imgcodecs__ios.html',1,'']]], + ['ios_20glue_20for_20video_20i_20o_586',['iOS glue for video I/O',['https://docs.opencv.org/4.2.0/d5/d26/group__videoio__ios.html',1,'']]], + ['ios_20hello_587',['OpenCV iOS Hello',['https://docs.opencv.org/4.2.0/d7/d88/tutorial_hello.html',1,'']]], + ['ios_20image_20processing_588',['OpenCV iOS - Image Processing',['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'']]], + ['ios_20video_20processing_589',['OpenCV iOS - Video Processing',['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'']]], + ['ios_2eh_590',['ios.h',['https://docs.opencv.org/4.2.0/df/dd5/ios_8h.html',1,'']]], + ['ios_5fbase_591',['ios_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html',1,'std']]], + ['ios_5fbase_2eh_592',['ios_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00386.html',1,'']]], + ['ios_5finstall_2emarkdown_593',['ios_install.markdown',['https://docs.opencv.org/4.2.0/d2/dc6/ios__install_8markdown.html',1,'']]], + ['iosfwd_594',['iosfwd',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00083.html',1,'']]], + ['iostate_595',['iostate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'basic_ios< char, _Traits >::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'basic_iostream< char >::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'basic_istream< char >::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'basic_istream< char, _Traits >::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'basic_ostream< char >::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'basic_ostream< char, _Traits >::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_fstream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_ifstream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_ios::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_iostream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_istream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_istringstream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_ofstream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_ostream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_ostringstream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::basic_stringstream::iostate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0487f09dbaf55c34d14350a54daf0bbd',1,'std::ios_base::iostate']]], + ['iostream_596',['iostream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00086.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga5eca2cc3d038099cf2465636dfb2ace6',1,'std::iostream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga5eca2cc3d038099cf2465636dfb2ace6',1,'iostream(Global Namespace)']]], + ['iota_597',['iota',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#gae2511dfcafd338758fa6670e3055bec1',1,'std::iota()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#gae2511dfcafd338758fa6670e3055bec1',1,'iota()(Global Namespace)']]], + ['ioutlierrejector_598',['IOutlierRejector',['https://docs.opencv.org/4.2.0/d9/dbb/classcv_1_1videostab_1_1IOutlierRejector.html',1,'cv::videostab']]], + ['iplmagno_599',['IplMagno',['https://docs.opencv.org/4.2.0/d2/df5/structcv_1_1bioinspired_1_1RetinaParameters.html#a1875391e7a0ef9fb82cc88b4b700f3de',1,'cv::bioinspired::RetinaParameters']]], + ['iplmagnoparameters_600',['IplMagnoParameters',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters'],['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a0d15280a2a8850b966b2059254062281',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters::IplMagnoParameters()']]], + ['ipp_20asynchronous_20c_20c_20converters_601',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], + ['iqa_20api_602',['Image Quality Analysis (IQA) API',['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'']]], + ['ir_5faffine_603',['IR_affine',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1datasets_1_1IR__affine.html',1,'cv::datasets']]], + ['ir_5faffine_2ehpp_604',['ir_affine.hpp',['https://docs.opencv.org/4.2.0/d8/d32/ir__affine_8hpp.html',1,'']]], + ['ir_5faffineobj_605',['IR_affineObj',['https://docs.opencv.org/4.2.0/d9/dff/structcv_1_1datasets_1_1IR__affineObj.html',1,'cv::datasets']]], + ['ir_5frobot_606',['IR_robot',['https://docs.opencv.org/4.2.0/d7/d5f/classcv_1_1datasets_1_1IR__robot.html',1,'cv::datasets']]], + ['ir_5frobot_2ehpp_607',['ir_robot.hpp',['https://docs.opencv.org/4.2.0/d4/d5f/ir__robot_8hpp.html',1,'']]], + ['ir_5frobotobj_608',['IR_robotObj',['https://docs.opencv.org/4.2.0/d8/d7d/structcv_1_1datasets_1_1IR__robotObj.html',1,'cv::datasets']]], + ['is_609',['IS',['https://docs.opencv.org/4.2.0/d0/dc4/classcv_1_1GFluidKernel.html#a9b302cf0f61f16dda9d192b9c0c12627',1,'cv::GFluidKernel']]], + ['is_610',['is',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af6d5ac31c2da7cd350672e88a4b6c89e',1,'__ctype_abstract_base< wchar_t >::is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a98b93b10d5d0700394d0dbd2dd1a3742',1,'__ctype_abstract_base< wchar_t >::is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af6d5ac31c2da7cd350672e88a4b6c89e',1,'std::__ctype_abstract_base::is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a98b93b10d5d0700394d0dbd2dd1a3742',1,'std::__ctype_abstract_base::is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af6d5ac31c2da7cd350672e88a4b6c89e',1,'std::ctype::is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a98b93b10d5d0700394d0dbd2dd1a3742',1,'std::ctype::is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a966c54a29d5fb4424486f74ceacaed4a',1,'std::ctype< char >::is(mask __m, char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a3f98c7b3851c877d90a1c55102506b30',1,'std::ctype< char >::is(const char *__lo, const char *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af6d5ac31c2da7cd350672e88a4b6c89e',1,'std::ctype< wchar_t >::is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a98b93b10d5d0700394d0dbd2dd1a3742',1,'std::ctype< wchar_t >::is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af6d5ac31c2da7cd350672e88a4b6c89e',1,'std::ctype_byname::is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a98b93b10d5d0700394d0dbd2dd1a3742',1,'std::ctype_byname::is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a966c54a29d5fb4424486f74ceacaed4a',1,'std::ctype_byname< char >::is(mask __m, char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a3f98c7b3851c877d90a1c55102506b30',1,'std::ctype_byname< char >::is(const char *__lo, const char *__hi, mask *__vec) const']]], + ['is_5fabstract_611',['is_abstract',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03507.html',1,'std']]], + ['is_5falways_5fequal_612',['is_always_equal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#afae6957b1a6d68084b2b6114dff01ae8',1,'__alloc_traits< _Tp_alloc_type >::is_always_equal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#afae6957b1a6d68084b2b6114dff01ae8',1,'__gnu_cxx::__alloc_traits::is_always_equal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#afae6957b1a6d68084b2b6114dff01ae8',1,'allocator_traits< _Tp_alloc_type >::is_always_equal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#afae6957b1a6d68084b2b6114dff01ae8',1,'std::allocator_traits::is_always_equal'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a90f7e4bb63b02a787cac38f4ab470488',1,'std::allocator_traits< allocator< _Tp > >::is_always_equal']]], + ['is_5farithmetic_613',['is_arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03415.html',1,'std']]], + ['is_5farray_614',['is_array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03219.html',1,'std::is_array< class >'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab5b70d60a636b9c5e10f6c8caac60b9e.html#ab5b70d60a636b9c5e10f6c8caac60b9e',1,'nlohmann::basic_json::is_array()']]], + ['is_5fassignable_615',['is_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03695.html',1,'std']]], + ['is_5fassignable_3c_20_5ftp_20_26_2c_20_5ftp_20_26_26_20_3e_616',['is_assignable< _Tp &, _Tp && >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03695.html',1,'']]], + ['is_5fassignable_3c_20_5ftp_20_26_2c_20const_20_5ftp_20_26_20_3e_617',['is_assignable< _Tp &, const _Tp & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03695.html',1,'']]], + ['is_5fbase_5fof_618',['is_base_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03903.html',1,'std']]], + ['is_5fbinary_619',['is_binary',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9576224f7b3ff812a308e7c1e784ea80.html#a9576224f7b3ff812a308e7c1e784ea80',1,'nlohmann::basic_json']]], + ['is_5fbind_5fexpression_620',['is_bind_expression',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02099.html',1,'std']]], + ['is_5fbind_5fexpression_3c_20_5fbind_3c_20_5fsignature_20_3e_20_3e_621',['is_bind_expression< _Bind< _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02155.html',1,'std']]], + ['is_5fbind_5fexpression_3c_20_5fbind_5fresult_3c_20_5fresult_2c_20_5fsignature_20_3e_20_3e_622',['is_bind_expression< _Bind_result< _Result, _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02171.html',1,'std']]], + ['is_5fbind_5fexpression_3c_20const_20_5fbind_3c_20_5fsignature_20_3e_20_3e_623',['is_bind_expression< const _Bind< _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02159.html',1,'std']]], + ['is_5fbind_5fexpression_3c_20const_20_5fbind_5fresult_3c_20_5fresult_2c_20_5fsignature_20_3e_20_3e_624',['is_bind_expression< const _Bind_result< _Result, _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02175.html',1,'std']]], + ['is_5fbind_5fexpression_3c_20const_20volatile_20_5fbind_3c_20_5fsignature_20_3e_20_3e_625',['is_bind_expression< const volatile _Bind< _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02167.html',1,'std']]], + ['is_5fbind_5fexpression_3c_20const_20volatile_20_5fbind_5fresult_3c_20_5fresult_2c_20_5fsignature_20_3e_20_3e_626',['is_bind_expression< const volatile _Bind_result< _Result, _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02183.html',1,'std']]], + ['is_5fbind_5fexpression_3c_20volatile_20_5fbind_3c_20_5fsignature_20_3e_20_3e_627',['is_bind_expression< volatile _Bind< _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02163.html',1,'std']]], + ['is_5fbind_5fexpression_3c_20volatile_20_5fbind_5fresult_3c_20_5fresult_2c_20_5fsignature_20_3e_20_3e_628',['is_bind_expression< volatile _Bind_result< _Result, _Signature > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02179.html',1,'std']]], + ['is_5fboolean_629',['is_boolean',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a911b11e855e685fa59ea1d111490b36b.html#a911b11e855e685fa59ea1d111490b36b',1,'nlohmann::basic_json']]], + ['is_5fbounded_630',['is_bounded',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a73d31de0788cee8f432f0a9075e97a76',1,'std::__numeric_limits_base::is_bounded'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a73d31de0788cee8f432f0a9075e97a76',1,'std::numeric_limits::is_bounded']]], + ['is_5fbsds_631',['IS_bsds',['https://docs.opencv.org/4.2.0/dd/d0e/classcv_1_1datasets_1_1IS__bsds.html',1,'cv::datasets']]], + ['is_5fbsds_2ehpp_632',['is_bsds.hpp',['https://docs.opencv.org/4.2.0/df/d12/is__bsds_8hpp.html',1,'']]], + ['is_5fbsdsobj_633',['IS_bsdsObj',['https://docs.opencv.org/4.2.0/db/d07/structcv_1_1datasets_1_1IS__bsdsObj.html',1,'cv::datasets']]], + ['is_5fclass_634',['is_class',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03295.html',1,'std']]], + ['is_5fcompile_5farg_635',['is_compile_arg',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#af956decf22b4f8834bc2f5c998676428',1,'cv::detail']]], + ['is_5fcompound_636',['is_compound',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03435.html',1,'std']]], + ['is_5fconst_637',['is_const',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03459.html',1,'std::is_const< class >'],['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#af42665cc886e8b5d39830e0edb40d8c1ac77245fd19edebbf4c1fc7dad7ecc091',1,'cv::cudev::TypeTraits::is_const']]], + ['is_5fconstructible_638',['is_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03587.html',1,'std']]], + ['is_5fconstructible_3c_20_5ftp_2c_20_5ftp_20_26_26_20_3e_639',['is_constructible< _Tp, _Tp && >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03587.html',1,'']]], + ['is_5fconstructible_3c_20_5ftp_2c_20const_20_5ftp_20_26_20_3e_640',['is_constructible< _Tp, const _Tp & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03587.html',1,'']]], + ['is_5fconvertible_641',['is_convertible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03915.html',1,'std']]], + ['is_5fcopy_5fassignable_642',['is_copy_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03711.html',1,'std']]], + ['is_5fcopy_5fconstructible_643',['is_copy_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03607.html',1,'std']]], + ['is_5fdefault_5fconstructible_644',['is_default_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03591.html',1,'std']]], + ['is_5fdestructible_645',['is_destructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03555.html',1,'std']]], + ['is_5fdiscarded_646',['is_discarded',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aecaaa0613d3f3a5b49b34b02afc5f85d.html#aecaaa0613d3f3a5b49b34b02afc5f85d',1,'nlohmann::basic_json']]], + ['is_5fempty_647',['is_empty',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03495.html',1,'std']]], + ['is_5femptyset_648',['is_emptyset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#a65ed1ee8eb1992fd9d4a25898d2a0db2',1,'std::tr2::bool_set']]], + ['is_5fenum_649',['is_enum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03287.html',1,'std']]], + ['is_5ferror_5fcode_5fenum_650',['is_error_code_enum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02827.html',1,'std']]], + ['is_5ferror_5fcode_5fenum_3c_20future_5ferrc_20_3e_651',['is_error_code_enum< future_errc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02231.html',1,'std']]], + ['is_5ferror_5fcondition_5fenum_652',['is_error_condition_enum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02831.html',1,'std']]], + ['is_5fexact_653',['is_exact',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a81640a55cbeb9fccfbedd74ce954a439',1,'std::__numeric_limits_base::is_exact'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a81640a55cbeb9fccfbedd74ce954a439',1,'std::numeric_limits::is_exact']]], + ['is_5ffinal_654',['is_final',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03503.html',1,'std']]], + ['is_5ffloat_655',['is_float',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a0c1d429642e695e89ecca1dea947cba9a1ee61db9efb22adcecbc9aa939729799',1,'cv::cudev::TypeTraits']]], + ['is_5ffloating_5fpoint_656',['is_floating_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03215.html',1,'std']]], + ['is_5ffloating_5fpoint_3c_20_5frep_20_3e_657',['is_floating_point< _Rep >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03215.html',1,'']]], + ['is_5ffunction_658',['is_function',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03259.html',1,'std']]], + ['is_5ffundamental_659',['is_fundamental',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03419.html',1,'std']]], + ['is_5fgarg_660',['is_garg',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a114e5a006e6617de4f375c9efc02d74f',1,'cv::detail']]], + ['is_5fgmat_5ftype_661',['is_gmat_type',['https://docs.opencv.org/4.2.0/d9/dc3/structcv_1_1detail_1_1is__gmat__type.html',1,'cv::detail']]], + ['is_5fgrow_5fneeded_662',['is_grow_needed',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#ad50aebe50070ae305b6c17a522bf6d0b',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::is_grow_needed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a5ae2c89a2bd75110d67fef5f361fed8c',1,'__gnu_pbds::sample_resize_trigger::is_grow_needed()']]], + ['is_5fheap_663',['is_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga33b76a74543508747285e182dce4e7ba',1,'std::is_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga37f2af54af0ffe3b364736c8bd84314e',1,'std::is_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga33b76a74543508747285e182dce4e7ba',1,'is_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga37f2af54af0ffe3b364736c8bd84314e',1,'is_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], + ['is_5fheap_5funtil_664',['is_heap_until',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gad3cf2f5b736b585f20dfd29ba24293e1',1,'std::is_heap_until(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gac559e3fbb78b63111a38545f7f530f23',1,'std::is_heap_until(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gad3cf2f5b736b585f20dfd29ba24293e1',1,'is_heap_until(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gac559e3fbb78b63111a38545f7f530f23',1,'is_heap_until(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], + ['is_5fiec559_665',['is_iec559',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a76fdc688c82a37689f4920a9776fc593',1,'std::__numeric_limits_base::is_iec559'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a76fdc688c82a37689f4920a9776fc593',1,'std::numeric_limits::is_iec559']]], + ['is_5findeterminate_666',['is_indeterminate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#a584b2bb82827cf99abbe1e59f2bb683c',1,'std::tr2::bool_set']]], + ['is_5finteger_667',['is_integer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a1080a407fe101570ab1a619fe8071396',1,'std::__numeric_limits_base::is_integer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a1080a407fe101570ab1a619fe8071396',1,'std::numeric_limits::is_integer']]], + ['is_5fintegral_668',['is_integral',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03195.html',1,'std::is_integral< class >'],['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a3a4f8b3e2a620fa6b5d0094508dbbc2da3b4d37f77948252f4b1cc2b193b53fb7',1,'cv::cudev::TypeTraits::is_integral']]], + ['is_5fliteral_5ftype_669',['is_literal_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03491.html',1,'std']]], + ['is_5flvalue_5freference_670',['is_lvalue_reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03243.html',1,'std']]], + ['is_5fmember_5ffunction_5fpointer_671',['is_member_function_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03283.html',1,'std']]], + ['is_5fmember_5fobject_5fpointer_672',['is_member_object_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03271.html',1,'std']]], + ['is_5fmember_5fpointer_673',['is_member_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03427.html',1,'std']]], + ['is_5fmeta_5fdescr_674',['is_meta_descr',['https://docs.opencv.org/4.2.0/d3/d8d/structcv_1_1detail_1_1is__meta__descr.html',1,'cv::detail']]], + ['is_5fmeta_5fdescr_3c_20garraydesc_20_3e_675',['is_meta_descr< GArrayDesc >',['https://docs.opencv.org/4.2.0/dc/de2/structcv_1_1detail_1_1is__meta__descr_3_01GArrayDesc_01_4.html',1,'cv::detail']]], + ['is_5fmeta_5fdescr_3c_20gmatdesc_20_3e_676',['is_meta_descr< GMatDesc >',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1detail_1_1is__meta__descr_3_01GMatDesc_01_4.html',1,'cv::detail']]], + ['is_5fmeta_5fdescr_3c_20gscalardesc_20_3e_677',['is_meta_descr< GScalarDesc >',['https://docs.opencv.org/4.2.0/db/dbe/structcv_1_1detail_1_1is__meta__descr_3_01GScalarDesc_01_4.html',1,'cv::detail']]], + ['is_5fmodulo_678',['is_modulo',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a05f7c8b3b2be44d621e3fd1f0e738461',1,'std::__numeric_limits_base::is_modulo'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a05f7c8b3b2be44d621e3fd1f0e738461',1,'std::numeric_limits::is_modulo']]], + ['is_5fmove_5fassignable_679',['is_move_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03727.html',1,'std']]], + ['is_5fmove_5fconstructible_680',['is_move_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03623.html',1,'std']]], + ['is_5fnongapi_5ftype_681',['is_nongapi_type',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#ad57d9a185891336ec22959ec778d1e67',1,'cv::detail']]], + ['is_5fnothrow_5fassignable_682',['is_nothrow_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03735.html',1,'std']]], + ['is_5fnothrow_5fassignable_3c_20_5ftp_20_26_2c_20_5ftp_20_26_26_20_3e_683',['is_nothrow_assignable< _Tp &, _Tp && >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03735.html',1,'']]], + ['is_5fnothrow_5fassignable_3c_20_5ftp_20_26_2c_20const_20_5ftp_20_26_20_3e_684',['is_nothrow_assignable< _Tp &, const _Tp & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03735.html',1,'']]], + ['is_5fnothrow_5fconstructible_685',['is_nothrow_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03659.html',1,'std']]], + ['is_5fnothrow_5fconstructible_3c_20_5ftp_2c_20_5ftp_20_26_26_20_3e_686',['is_nothrow_constructible< _Tp, _Tp && >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03659.html',1,'']]], + ['is_5fnothrow_5fconstructible_3c_20_5ftp_2c_20const_20_5ftp_20_26_20_3e_687',['is_nothrow_constructible< _Tp, const _Tp & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03659.html',1,'']]], + ['is_5fnothrow_5fcopy_5fassignable_688',['is_nothrow_copy_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03751.html',1,'std']]], + ['is_5fnothrow_5fcopy_5fconstructible_689',['is_nothrow_copy_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03675.html',1,'std']]], + ['is_5fnothrow_5fdefault_5fconstructible_690',['is_nothrow_default_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03643.html',1,'std']]], + ['is_5fnothrow_5fdestructible_691',['is_nothrow_destructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03583.html',1,'std']]], + ['is_5fnothrow_5fmove_5fassignable_692',['is_nothrow_move_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03767.html',1,'std']]], + ['is_5fnothrow_5fmove_5fconstructible_693',['is_nothrow_move_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03691.html',1,'std']]], + ['is_5fnothrow_5fswappable_694',['is_nothrow_swappable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04483.html',1,'std']]], + ['is_5fnothrow_5fswappable_5fv_695',['is_nothrow_swappable_v',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa2b86e9636133cced6ebccab3e95fb0b',1,'std']]], + ['is_5fnothrow_5fswappable_5fwith_696',['is_nothrow_swappable_with',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04515.html',1,'std']]], + ['is_5fnothrow_5fswappable_5fwith_5fv_697',['is_nothrow_swappable_with_v',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a35b3f518dd97d4fa57eeb0ae8fd7622f',1,'std']]], + ['is_5fnull_698',['is_null',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aedc7afad96292b5ab61a2e0ad3067f5f.html#aedc7afad96292b5ab61a2e0ad3067f5f',1,'nlohmann::basic_json']]], + ['is_5fnull_5fpointer_699',['is_null_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03403.html',1,'std']]], + ['is_5fnumber_700',['is_number',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_abd47ac8eba63833152795280f75b5851.html#abd47ac8eba63833152795280f75b5851',1,'nlohmann::basic_json']]], + ['is_5fnumber_5ffloat_701',['is_number_float',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a116cdb9300b56519fc9cf756609296cb.html#a116cdb9300b56519fc9cf756609296cb',1,'nlohmann::basic_json']]], + ['is_5fnumber_5finteger_702',['is_number_integer',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac4b4acf2c0ad075c0dc125a65c102362.html#ac4b4acf2c0ad075c0dc125a65c102362',1,'nlohmann::basic_json']]], + ['is_5fnumber_5funsigned_703',['is_number_unsigned',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5493f2ed1e07b0ece428bd5a47e2fb95.html#a5493f2ed1e07b0ece428bd5a47e2fb95',1,'nlohmann::basic_json']]], + ['is_5fobj_5fwithout_5fholes_704',['is_obj_without_holes',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#a964d1931beeb3ff3a2792d1e86d39175',1,'cv::cuda::FGDParams']]], + ['is_5fobject_705',['is_object',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03423.html',1,'std::is_object< class >'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a57e8411a770a6263d6d8f2116c37f3aa.html#a57e8411a770a6263d6d8f2116c37f3aa',1,'nlohmann::basic_json::is_object()']]], + ['is_5fopen_706',['is_open',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a56ddf5ebdff55e7aaf51077a51c4d42f',1,'__gnu_cxx::enc_filebuf::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a56ddf5ebdff55e7aaf51077a51c4d42f',1,'__gnu_cxx::stdio_filebuf::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a56ddf5ebdff55e7aaf51077a51c4d42f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a56ddf5ebdff55e7aaf51077a51c4d42f',1,'basic_filebuf< char_type, traits_type >::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a56ddf5ebdff55e7aaf51077a51c4d42f',1,'std::basic_filebuf::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02079.html#a715c50358129e80ce7a37ee157c141a7',1,'std::basic_fstream::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02071.html#afcbe0c0931007c7359e16543abe1fe87',1,'std::basic_ifstream::is_open()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02075.html#aef0ea13a6d1c1bc6ee4f1ebc71e18414',1,'std::basic_ofstream::is_open()']]], + ['is_5fpartitioned_707',['is_partitioned',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaba1a020bbd42810ce065fa9e239652d6',1,'std::is_partitioned()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaba1a020bbd42810ce065fa9e239652d6',1,'is_partitioned()(Global Namespace)']]], + ['is_5fpermutation_708',['is_permutation',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gadc446c7587539490a05da590d6c51a58',1,'std::is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga714d45aee3d18a5e281557b48d092b8e',1,'std::is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _BinaryPredicate __pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga1ce2f1378028db705f805394b6e150a7',1,'std::is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad8c1b9d831347f0795b364b59b5c9daf',1,'std::is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2, _BinaryPredicate __pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gadc446c7587539490a05da590d6c51a58',1,'is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga714d45aee3d18a5e281557b48d092b8e',1,'is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _BinaryPredicate __pred)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga1ce2f1378028db705f805394b6e150a7',1,'is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad8c1b9d831347f0795b364b59b5c9daf',1,'is_permutation(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2, _BinaryPredicate __pred)(Global Namespace)']]], + ['is_5fplaceholder_709',['is_placeholder',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02103.html',1,'std']]], + ['is_5fplaceholder_3c_20_5fplaceholder_3c_20_5fnum_20_3e_20_3e_710',['is_placeholder< _Placeholder< _Num > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02111.html',1,'std']]], + ['is_5fpod_711',['is_pod',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03487.html',1,'std']]], + ['is_5fpointer_712',['is_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03239.html',1,'std::is_pointer< class >'],['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a8503f494dae8899dc034e2fc2e50f407aa0e8fdac033ac8c4a1d91cae4a30d081',1,'cv::cudev::TypeTraits::is_pointer']]], + ['is_5fpolymorphic_713',['is_polymorphic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03499.html',1,'std']]], + ['is_5fprimitive_714',['is_primitive',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a548d2d4013da24e7d7510d90febc80c4.html#a548d2d4013da24e7d7510d90febc80c4',1,'nlohmann::basic_json']]], + ['is_5freference_715',['is_reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03411.html',1,'std::is_reference< class >'],['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#acd65e5e1819f7b0001c1f577ab064a02a0e4da83f213adb8d0fbbe733fbbc4d87',1,'cv::cudev::TypeTraits::is_reference']]], + ['is_5fresize_5fneeded_716',['is_resize_needed',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a7c5123f36dfca1b53699730fd2d184e8',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::is_resize_needed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a58af3aa0d57d0192ac037607f26f37e5',1,'__gnu_pbds::sample_resize_policy::is_resize_needed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a7f3e6d0aaabbde56e883bf742f301a46',1,'__gnu_pbds::sample_resize_trigger::is_resize_needed()']]], + ['is_5frvalue_5freference_717',['is_rvalue_reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03251.html',1,'std']]], + ['is_5fsame_718',['is_same',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03895.html',1,'std::is_same< class, class >'],['https://docs.opencv.org/4.2.0/d1/d34/structcv_1_1util_1_1detail_1_1type__list__index__helper.html#ae1453099bf8c995a01be9aa1ae707866',1,'cv::util::detail::type_list_index_helper::is_same']]], + ['is_5fscalar_719',['is_scalar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03431.html',1,'std::is_scalar< class >'],['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a4b6baa5b7a3c3ba8c776a8ca3eb70b13a312173208643daf68de8f6909ca9fefb',1,'cv::cudev::TypeTraits::is_scalar']]], + ['is_5fsetpoint_5fvalid_720',['is_setpoint_valid',['../classcontrol_1_1PlanarArmController.html#a5c18177ea8456ab6d5f696ef0225305d',1,'control::PlanarArmController']]], + ['is_5fsigned_721',['is_signed',['https://docs.opencv.org/4.2.0/da/d81/structcv_1_1cudev_1_1numeric__limits_3_01bool_01_4.html#aa198d700d80212f36881ac57bd18d0b3',1,'cv::cudev::numeric_limits< bool >::is_signed'],['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html#abd973ff57ee6cf9ce436ca4c24fb1912',1,'cv::cudev::numeric_limits< double >::is_signed'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html#aaea688b0456889aada71b29a157e631e',1,'cv::cudev::numeric_limits< float >::is_signed'],['https://docs.opencv.org/4.2.0/da/d4e/structcv_1_1cudev_1_1numeric__limits_3_01schar_01_4.html#ae7adb637089ac7ab75e8970f01873b1a',1,'cv::cudev::numeric_limits< schar >::is_signed'],['https://docs.opencv.org/4.2.0/d1/d8b/structcv_1_1cudev_1_1numeric__limits_3_01short_01_4.html#a33a346ba8cdd6be6a9defa77be7ed54b',1,'cv::cudev::numeric_limits< short >::is_signed'],['https://docs.opencv.org/4.2.0/d3/dc7/structcv_1_1cudev_1_1numeric__limits_3_01uchar_01_4.html#a3c94d331147034dd35a918973f9b8920',1,'cv::cudev::numeric_limits< uchar >::is_signed'],['https://docs.opencv.org/4.2.0/dd/d89/structcv_1_1cudev_1_1numeric__limits_3_01uint_01_4.html#a9c1561950370fa6d05d0e2b2f738a003',1,'cv::cudev::numeric_limits< uint >::is_signed'],['https://docs.opencv.org/4.2.0/df/d47/structcv_1_1cudev_1_1numeric__limits_3_01ushort_01_4.html#ada06dd9385aae7a229b5a3252be1ca6e',1,'cv::cudev::numeric_limits< ushort >::is_signed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ac9fad027d1b91ec445d58e5036e8ea0b',1,'std::__numeric_limits_base::is_signed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ac9fad027d1b91ec445d58e5036e8ea0b',1,'std::numeric_limits::is_signed']]], + ['is_5fsigned_5fint_722',['is_signed_int',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a13588798235cb4a6cd1e3e2e1832ed6aa5f6a9241455b0b3feddcc9f30105567f',1,'cv::cudev::TypeTraits']]], + ['is_5fsingleton_723',['is_singleton',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#a967a4154ed069a5c9dfd55f53f60de2b',1,'std::tr2::bool_set']]], + ['is_5fsorted_724',['is_sorted',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a5337f3b4d2394123033a6c6279abbb',1,'std::is_sorted(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaba6fffa1d87bd34155dcd980bbe02a53',1,'std::is_sorted(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a5337f3b4d2394123033a6c6279abbb',1,'is_sorted(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaba6fffa1d87bd34155dcd980bbe02a53',1,'is_sorted(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], + ['is_5fsorted_5funtil_725',['is_sorted_until',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga76cfb20887dfce8ce554053b6b6935c9',1,'std::is_sorted_until(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga07069e2148fa7ce5fc6df47a43fd8240',1,'std::is_sorted_until(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga76cfb20887dfce8ce554053b6b6935c9',1,'is_sorted_until(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga07069e2148fa7ce5fc6df47a43fd8240',1,'is_sorted_until(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], + ['is_5fspecialized_726',['is_specialized',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ac5f6c4f5343b7060e87d95c2ddb406eb',1,'std::__numeric_limits_base::is_specialized'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ac5f6c4f5343b7060e87d95c2ddb406eb',1,'std::numeric_limits::is_specialized']]], + ['is_5fstandard_5flayout_727',['is_standard_layout',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03483.html',1,'std']]], + ['is_5fstring_728',['is_string',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab303d17366c26fca12242c7f8def1bb7.html#ab303d17366c26fca12242c7f8def1bb7',1,'nlohmann::basic_json']]], + ['is_5fstructured_729',['is_structured',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4e05a7d5deec758f1d830741b68b4249.html#a4e05a7d5deec758f1d830741b68b4249',1,'nlohmann::basic_json']]], + ['is_5fswappable_730',['is_swappable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04479.html',1,'std']]], + ['is_5fswappable_5fv_731',['is_swappable_v',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9f35f5ddaff13c2c1d262efe1fbdd510',1,'std']]], + ['is_5fswappable_5fwith_732',['is_swappable_with',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04511.html',1,'std']]], + ['is_5fswappable_5fwith_5fv_733',['is_swappable_with_v',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5e63c1d59eac70153a804ab6bacc3d1f',1,'std']]], + ['is_5fthread_5fsafe_5f_734',['is_thread_safe_',['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#ae3b24af101c26164a5a253b7d1c37dda',1,'cv::detail::FeaturesMatcher']]], + ['is_5ftrivial_735',['is_trivial',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03475.html',1,'std']]], + ['is_5ftrivially_5fassignable_736',['is_trivially_assignable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03827.html',1,'std']]], + ['is_5ftrivially_5fconstructible_737',['is_trivially_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03771.html',1,'std']]], + ['is_5ftrivially_5fdefault_5fconstructible_738',['is_trivially_default_constructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03775.html',1,'std']]], + ['is_5ftrivially_5fdestructible_739',['is_trivially_destructible',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03863.html',1,'std']]], + ['is_5ftuple_740',['is_tuple',['https://docs.opencv.org/4.2.0/dd/d08/structcv_1_1cudev_1_1TupleTraits.html#af056351d95043ecb7978a89683f37acda119ce0267b22821a9816b64e305aa324',1,'cv::cudev::TupleTraits::is_tuple'],['https://docs.opencv.org/4.2.0/d2/dae/structcv_1_1cudev_1_1TupleTraits_3_01tuple_3_01P0_00_01P1_00_01P2_00_01P3_00_01P4_00_01P5_00_01P41642a2d25b95a5ddb87ca2004b28336.html#a101fdabed1a4325f149f1dd0fb4ef409a1179218adcd5afa3010f2a53e8c080fa',1,'cv::cudev::TupleTraits< tuple< P0, P1, P2, P3, P4, P5, P6, P7, P8, P9 > >::is_tuple']]], + ['is_5funion_741',['is_union',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03291.html',1,'std']]], + ['is_5funsigned_5fint_742',['is_unsigned_int',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#ad6ae9669fd006f425815f5340c1f542fa03b990e48682d85d943ebfa60d3e5830',1,'cv::cudev::TypeTraits']]], + ['is_5fvec_743',['is_vec',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a5439cb3d9a68aaec7292a0d99dd22a87a4658592db01008e688603ac4f31442fe',1,'cv::cudev::TypeTraits']]], + ['is_5fvoid_744',['is_void',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03127.html',1,'std']]], + ['is_5fvolatile_745',['is_volatile',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03467.html',1,'std::is_volatile< class >'],['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#adf45e5dd0585f4fa9d2c811f63e122e7a3acffbbfc9cce12550844c3d8420699b',1,'cv::cudev::TypeTraits::is_volatile']]], + ['is_5fweizmann_746',['IS_weizmann',['https://docs.opencv.org/4.2.0/d9/dbe/classcv_1_1datasets_1_1IS__weizmann.html',1,'cv::datasets']]], + ['is_5fweizmann_2ehpp_747',['is_weizmann.hpp',['https://docs.opencv.org/4.2.0/d3/db5/is__weizmann_8hpp.html',1,'']]], + ['is_5fweizmannobj_748',['IS_weizmannObj',['https://docs.opencv.org/4.2.0/d8/d65/structcv_1_1datasets_1_1IS__weizmannObj.html',1,'cv::datasets']]], + ['isaligned_749',['isAligned',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gadbc1b082037ac3725f3b12fe6c541c61',1,'cv::isAligned(const T &data)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga0097dcc52f97e95d694a887f523b7d81',1,'cv::isAligned(const void *p1)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae3ed31d1c50282265abcb27c669d51bb',1,'cv::isAligned(const void *p1, const void *p2)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga4a80b9260cb1a5b3b07217cf42d0474d',1,'cv::isAligned(const void *p1, const void *p2, const void *p3)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga74dc86ab666c4a81841b6bed3f68742e',1,'cv::isAligned(const void *p1, const void *p2, const void *p3, const void *p4)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gadbc1b082037ac3725f3b12fe6c541c61',1,'isAligned(const T &data)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga0097dcc52f97e95d694a887f523b7d81',1,'isAligned(const void *p1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae3ed31d1c50282265abcb27c669d51bb',1,'isAligned(const void *p1, const void *p2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga4a80b9260cb1a5b3b07217cf42d0474d',1,'isAligned(const void *p1, const void *p2, const void *p3)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga74dc86ab666c4a81841b6bed3f68742e',1,'isAligned(const void *p1, const void *p2, const void *p3, const void *p4)(Global Namespace)']]], + ['isalnum_750',['isalnum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5ed2f4fbd4906acc523688bd4413c0a7',1,'std']]], + ['isalpha_751',['isalpha',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad9b540b5d331edca5e6b8c9ac0ae2b41',1,'std']]], + ['isamd_752',['isAMD',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a493978e6044f4eeb81a0c187c7441269',1,'cv::ocl::Device']]], + ['isanyclosed_753',['isAnyClosed',['../classrobot_1_1types_1_1LimitSwitchData.html#a7a12a083516bc8cc9821a922dc3934c3',1,'robot::types::LimitSwitchData']]], + ['isanyopen_754',['isAnyOpen',['../classrobot_1_1types_1_1LimitSwitchData.html#ab321d51e5d4db4ab8b69e0a74198fd00',1,'robot::types::LimitSwitchData']]], + ['isapprox_755',['isApprox',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ad785aecce6792bd88c3a4de35d782f18',1,'Eigen::AlignedBox::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#ac0f2fe0856dedd6f46891a70ec9f402d',1,'Eigen::AngleAxis::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae8443357b808cd393be1b51974213f9c',1,'Eigen::DenseBase::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae8443357b808cd393be1b51974213f9c',1,'DenseBase< ArrayWrapper< ExpressionType > >::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae8443357b808cd393be1b51974213f9c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae8443357b808cd393be1b51974213f9c',1,'DenseBase< Solve< Decomposition, RhsType > >::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ad5f22e31d700adf1144eecda45075494',1,'Eigen::Hyperplane::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#adb58b8eb1d9a81a4b02b7bbbebd84413',1,'Eigen::ParametrizedLine::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a64bc41c96a9e99567e0f8409f8f0f680',1,'Eigen::QuaternionBase::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a64bc41c96a9e99567e0f8409f8f0f680',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a64bc41c96a9e99567e0f8409f8f0f680',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a64bc41c96a9e99567e0f8409f8f0f680',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a9c6889cb1a96ab8549effc94bfa06cd6',1,'Eigen::Rotation2D::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#abd1696d9bb754e5c8734e691e03243f9',1,'Eigen::Transform::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a3dfc243795eef9c94bf65f0837f563c8',1,'Eigen::Translation::isApprox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a7f736fdbe43f7bce3d277312efdc315e',1,'Eigen::UniformScaling::isApprox()']]], + ['isapproxtoconstant_756',['isApproxToConstant',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9b150d48bc5e4366887ccb466e40c6b',1,'Eigen::DenseBase::isApproxToConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9b150d48bc5e4366887ccb466e40c6b',1,'DenseBase< ArrayWrapper< ExpressionType > >::isApproxToConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9b150d48bc5e4366887ccb466e40c6b',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isApproxToConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9b150d48bc5e4366887ccb466e40c6b',1,'DenseBase< Solve< Decomposition, RhsType > >::isApproxToConstant()']]], + ['isbinaryfunction_757',['IsBinaryFunction',['https://docs.opencv.org/4.2.0/d1/de5/structcv_1_1cudev_1_1IsBinaryFunction.html',1,'cv::cudev']]], + ['isblank_758',['isblank',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a40d8b84052bcaa94888bad01890ce72c',1,'std']]], + ['iscanceled_759',['isCanceled',['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1gapi_1_1wip_1_1GAsyncContext.html#a92dc8ba8ab9e78d1cb0bd648a6452fe4',1,'cv::gapi::wip::GAsyncContext']]], + ['isclassifier_760',['isClassifier',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#a1121a835feedefdcdb8624966567aec6',1,'cv::ml::StatModel']]], + ['isclosed_761',['isClosed',['../classrobot_1_1types_1_1LimitSwitchData.html#ae50bfaab487c0f45a2b9d9d85f3d6429',1,'robot::types::LimitSwitchData']]], + ['iscntrl_762',['iscntrl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#adcec25eda0a6f12b4c9d7453f30a5a69',1,'std']]], + ['iscollection_763',['isCollection',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ab007ad87e7cc2fdd6e6e5db86dbd805c',1,'cv::FileNode']]], + ['iscompatible_764',['isCompatible',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a33fee042c8998a4af0ec5d0f81d7a3b3',1,'cv::cuda::DeviceInfo']]], + ['iscompressed_765',['isCompressed',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'Eigen::SparseCompressedBase::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< Derived >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseCompressedBase< Transpose< MatrixType > >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#aafab4afa7ab2ff89eff049d4c71e2ce4',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'Eigen::SparseMatrix::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseMatrix< Scalar >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseMatrix< Scalar, ColMajor, int >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::isCompressed()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae257333ca0e0b16cf5d3080bbefeaf47',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::isCompressed()']]], + ['isconstant_766',['isConstant',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1ca84e4179b3e5081ed11d89bbd9e74f',1,'Eigen::DenseBase::isConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1ca84e4179b3e5081ed11d89bbd9e74f',1,'DenseBase< ArrayWrapper< ExpressionType > >::isConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1ca84e4179b3e5081ed11d89bbd9e74f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1ca84e4179b3e5081ed11d89bbd9e74f',1,'DenseBase< Solve< Decomposition, RhsType > >::isConstant()']]], + ['iscontinuous_767',['isContinuous',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#af38d2ea2a7ec65f622d267eed4863578',1,'cv::_InputArray::isContinuous()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a400fc4c7880bf132f2ffea03892486b0',1,'cv::cuda::GpuMat::isContinuous()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ad091db7d7ddc0e484d2556cf36b8e0af',1,'cv::cuda::HostMem::isContinuous()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa90cea495029c7d1ee0a41361ccecdf3',1,'cv::Mat::isContinuous()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#af9f1dc7d12bb762061089e1c3bd77875',1,'cv::UMat::isContinuous()']]], + ['iscontourconvex_768',['isContourConvex',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8abf8010377b58cbc16db6734d92941b',1,'cv::isContourConvex()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8abf8010377b58cbc16db6734d92941b',1,'isContourConvex()(Global Namespace)']]], + ['iscounting_769',['isCounting',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#ab001a82eb5b4c3af9145733dc6cad213',1,'INCVMemAllocator::isCounting()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#ad68c654e99d7cee2ee5f8748872d0991',1,'NCVMemNativeAllocator::isCounting()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#a48e22bb3fca10c405624df97c955e9c3',1,'NCVMemStackAllocator::isCounting()']]], + ['isctype_770',['isctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ad819d5f658133c4dd71c1fa5a7cb9031',1,'regex_traits< _CharType >::isctype()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ad819d5f658133c4dd71c1fa5a7cb9031',1,'std::regex_traits::isctype()']]], + ['isdiagonal_771',['isDiagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a97027ea54c8cd1ddb1c578fee5cedc67',1,'Eigen::MatrixBase::isDiagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a97027ea54c8cd1ddb1c578fee5cedc67',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isDiagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a97027ea54c8cd1ddb1c578fee5cedc67',1,'MatrixBase< Solve< Decomposition, RhsType > >::isDiagonal()']]], + ['isdigit_772',['isdigit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a385dc92279bd0d29a34d143be653d0e1',1,'std']]], + ['isdirectory_773',['isDirectory',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#a26219f574f38cb8f632621a6042c8a9c',1,'cv::utils::fs']]], + ['isdone_774',['isDone',['../classcommands_1_1DriveToWaypointCommand.html#a238d0bd5012fbc251d421d670b796283',1,'commands::DriveToWaypointCommand']]], + ['isempty_775',['isEmpty',['https://docs.opencv.org/4.2.0/df/dba/classcv_1_1dpm_1_1DPMDetector.html#a68ccc5923115564aa0bb6f43d6d11ebd',1,'cv::dpm::DPMDetector::isEmpty()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a2d994551368f0d06876a31dccb26de59',1,'Eigen::AlignedBox::isEmpty()']]], + ['isemptycollection_776',['isEmptyCollection',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a60ff5026e4027e7dfab7021d14784a0e',1,'cv::FileNode']]], + ['isemptyframeoffset_777',['isEmptyFrameOffset',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a822f556e73f50162e295b2ba57b0f4ad',1,'cv::AVIWriteContainer']]], + ['isemptyframesize_778',['isEmptyFrameSize',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#accb77bc2f0a14820da7ec9e2c63b098d',1,'cv::AVIWriteContainer']]], + ['isextensionsupported_779',['isExtensionSupported',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a741dffeacbcc911d273c8f248e4fb323',1,'cv::ocl::Device']]], + ['isfinite_780',['isfinite',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#aba24ec81dec745a00b7f33adead89811',1,'Eigen']]], + ['isflow_781',['isFlow',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#abde856ed7e0ba8d3d0fdaf3c5b64dc28',1,'cv::FileNode']]], + ['isformatsupported_782',['isFormatSupported',['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#ae864e2b519e2533923aafbba2bdd3f7d',1,'cv::ocl::Image2D']]], + ['isfree_783',['isfree',['https://docs.opencv.org/4.2.0/d4/dbc/structcv_1_1Subdiv2D_1_1QuadEdge.html#a76603c01b665d05416c67dffcfb9058f',1,'cv::Subdiv2D::QuadEdge::isfree()'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a162921ccd975e6588ead65defbd71c38',1,'cv::Subdiv2D::Vertex::isfree()']]], + ['isfresh_784',['isFresh',['../classrobot_1_1types_1_1DataPoint.html#a170f57107f592540c5fc6a548a0621e9',1,'robot::types::DataPoint']]], + ['isgpumat_785',['isGpuMat',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a541a32b10224d53e8407ba0bb2c8f076',1,'cv::_InputArray']]], + ['isgpumatvector_786',['isGpuMatVector',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a2f3eb944ab23455d4a0c5db922a3705b',1,'cv::_InputArray']]], + ['isgraph_787',['isgraph',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a03fa822c443ea8d03c55c7a4affc204f',1,'std']]], + ['isidentity_788',['isIdentity',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a4ccbd8dfa06e9d47b9bf84711f8b9d40',1,'Eigen::MatrixBase::isIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a4ccbd8dfa06e9d47b9bf84711f8b9d40',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a4ccbd8dfa06e9d47b9bf84711f8b9d40',1,'MatrixBase< Solve< Decomposition, RhsType > >::isIdentity()']]], + ['isidmapped_789',['isIDMapped',['../classAR_1_1MarkerSet.html#a79ad36749ca8409352d3be0d9574212d',1,'AR::MarkerSet']]], + ['isinf_790',['isInf',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4baf2433a45e75cd5adcd27f944265c1',1,'cv::softdouble::isInf()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga361d1cbf6593c26ea61285d094b5aa54',1,'cv::softfloat::isInf()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga361d1cbf6593c26ea61285d094b5aa54',1,'isInf()(Global Namespace)']]], + ['isinf_791',['isinf',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a1f1103712e337c4c96a05f949637a4c8',1,'Eigen']]], + ['isinit_792',['isInit',['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a4f32981bce5a9c55d46d048089ff65f6',1,'cv::Tracker']]], + ['isinitialized_793',['isInitialized',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a2690ff629378e78f6d2d1d1e5b6e317b',1,'cv::ccalib::CustomPattern::isInitialized()'],['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#aa537f9cda2a22dcb69e7ea89ba6edabc',1,'INCVMemAllocator::isInitialized()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#a88bcdf07f57526a3f1f00c6350276129',1,'NCVMemNativeAllocator::isInitialized()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#ac099da57816008471815f17c64beda0e',1,'NCVMemStackAllocator::isInitialized()']]], + ['isinjective_794',['isInjective',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a0031998053c9c7345c9458f7443aa263',1,'Eigen::ColPivHouseholderQR::isInjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a0031998053c9c7345c9458f7443aa263',1,'ColPivHouseholderQR< MatrixType >::isInjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a2740067b81ec3e0ad20a2bea9a5a475f',1,'Eigen::CompleteOrthogonalDecomposition::isInjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a6776788011026b0f63192485a59deaed',1,'Eigen::FullPivHouseholderQR::isInjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#ab13992c852aa593461d9b81790b56667',1,'Eigen::FullPivLU::isInjective()']]], + ['isint_795',['isInt',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a38b79c9ea8309f61627a27c3818ec894',1,'cv::dnn::DictValue::isInt()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aeac30395ae3473911171a2091c6ab74c',1,'cv::FileNode::isInt()']]], + ['isintegral_796',['isIntegral',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#ad4380bce54af16ade9ceb3950653b728',1,'cv::CvHaarEvaluator::isIntegral'],['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#ab2bfe0def9426436d79631529878f230',1,'cv::CvHaarFeatureParams::isIntegral'],['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html#a9cc81d32c81332139c15403ce726aeda',1,'cv::TrackerFeatureHAAR::Params::isIntegral']]], + ['isintel_797',['isIntel',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a38df2acd5461680d87a812d77ca02d5e',1,'cv::ocl::Device']]], + ['isinverted_798',['isInverted',['../structrobot_1_1encparams__t.html#a54ef590fd3dca30c9fed8d72738c4787',1,'robot::encparams_t']]], + ['isinvertible_799',['isInvertible',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a945720f8d683f8ebe97fa807edd3142a',1,'Eigen::ColPivHouseholderQR::isInvertible()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a945720f8d683f8ebe97fa807edd3142a',1,'ColPivHouseholderQR< MatrixType >::isInvertible()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a7c4f24f868295349a3bb99e5f217b069',1,'Eigen::CompleteOrthogonalDecomposition::isInvertible()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aeb1d779ec22ec68a5a28d4235db02ec1',1,'Eigen::FullPivHouseholderQR::isInvertible()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#afdf2579c93473650f2ef2a47a376c4a0',1,'Eigen::FullPivLU::isInvertible()']]], + ['isknown_800',['isKnown',['https://docs.opencv.org/4.2.0/d4/dd9/structcvv_1_1impl_1_1CallMetaData.html#a0df9fb9a44398306c05e1b009caacb4d',1,'cvv::impl::CallMetaData']]], + ['island_801',['island',['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#a91a81b54c71d0c42bf9372a9e292ebe3',1,'cv::gapi']]], + ['isleftnodeleaf_802',['isLeftNodeLeaf',['https://docs.opencv.org/4.2.0/df/d88/structHaarFeatureDescriptor32.html#abca5878272c73ca3ca080d099f2356b4',1,'HaarFeatureDescriptor32']]], + ['islower_803',['islower',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a21d54d07c27156b1bb5c49155cbd58d1',1,'std']]], + ['islowertriangular_804',['isLowerTriangular',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1e96c42d79a56f0a6ade30ce031e17eb',1,'Eigen::MatrixBase::isLowerTriangular()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1e96c42d79a56f0a6ade30ce031e17eb',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isLowerTriangular()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1e96c42d79a56f0a6ade30ce031e17eb',1,'MatrixBase< Solve< Decomposition, RhsType > >::isLowerTriangular()']]], + ['ismap_805',['isMap',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#afe948d153d1962ff4c9ad02b1295d832',1,'cv::FileNode::isMap() const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a0be930eaeab2e06cbf2502913d0ec870',1,'cv::FileNode::isMap(int flags)']]], + ['ismaskedout_806',['isMaskedOut',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#acf9d628dd4c52e6ff00eb92801fd0921',1,'cv::DescriptorMatcher']]], + ['ismasksupported_807',['isMaskSupported',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#a15bc508b250c96ecd49e153dfcbf019a',1,'cv::BFMatcher::isMaskSupported()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a3cc074710ccb466a662815969e14cf5e',1,'cv::DescriptorMatcher::isMaskSupported()'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a356ddc4994cfc7543859fa96b5b229c1',1,'cv::cuda::DescriptorMatcher::isMaskSupported()'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a614976020b9ef7ecfc419b23e122206d',1,'cv::FlannBasedMatcher::isMaskSupported()']]], + ['ismat_808',['isMat',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7157baa2f1e8801053a5ff2a56006448',1,'cv::_InputArray']]], + ['ismatvector_809',['isMatVector',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#ad8b51d941c9a4286f2fc362d6e951bc2',1,'cv::_InputArray']]], + ['ismatx_810',['isMatx',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#af221eb464622ee46d0d3a8c63358023b',1,'cv::_InputArray']]], + ['ismemallocated_811',['isMemAllocated',['https://docs.opencv.org/4.2.0/d7/d3a/classNCVMatrixAlloc.html#a5cd5b740956cf2c5b5ccc5e1abc477fc',1,'NCVMatrixAlloc::isMemAllocated()'],['https://docs.opencv.org/4.2.0/d8/da0/classNCVVectorAlloc.html#aa805756efcfe48896890f1c9ef153a92',1,'NCVVectorAlloc::isMemAllocated()']]], + ['ismemreused_812',['isMemReused',['https://docs.opencv.org/4.2.0/df/d82/classNCVMatrixReuse.html#a6b7494fd1717f56be16c4e25362c7d06',1,'NCVMatrixReuse::isMemReused()'],['https://docs.opencv.org/4.2.0/da/d61/classNCVVectorReuse.html#a6fa6e78e73c0dc61241757d3d96627eb',1,'NCVVectorReuse::isMemReused()']]], + ['ismuchsmallerthan_813',['isMuchSmallerThan',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3c4db0c6dd974fa88bbb58b2cf3d5664',1,'Eigen::DenseBase::isMuchSmallerThan(const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adfca6ff4e473f68fbbeabbd03b7504a9',1,'Eigen::DenseBase::isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3c4db0c6dd974fa88bbb58b2cf3d5664',1,'DenseBase< ArrayWrapper< ExpressionType > >::isMuchSmallerThan(const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adfca6ff4e473f68fbbeabbd03b7504a9',1,'DenseBase< ArrayWrapper< ExpressionType > >::isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3c4db0c6dd974fa88bbb58b2cf3d5664',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isMuchSmallerThan(const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adfca6ff4e473f68fbbeabbd03b7504a9',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3c4db0c6dd974fa88bbb58b2cf3d5664',1,'DenseBase< Solve< Decomposition, RhsType > >::isMuchSmallerThan(const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adfca6ff4e473f68fbbeabbd03b7504a9',1,'DenseBase< Solve< Decomposition, RhsType > >::isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const']]], + ['isnamed_814',['isNamed',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa129964f34bc9c288bdd6195c71f0836',1,'cv::FileNode']]], + ['isnan_815',['isNaN',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae19d8a1b2dd1e0806c7d2de07f82f829',1,'cv::softdouble::isNaN()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5001848e8ce56d145ad32301981a12a9',1,'cv::softfloat::isNaN()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5001848e8ce56d145ad32301981a12a9',1,'isNaN()(Global Namespace)']]], + ['isnan_816',['isNan',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac1c740657f322dea194e709414743e81',1,'cv::viz::isNan(float x)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac89eaf4fd08fad1f55e315c0e67acf65',1,'cv::viz::isNan(double x)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga0d937e5774fedecb73ea47652f339a02',1,'cv::viz::isNan(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga1a10dc77396c81df53ad300ea4a426c8',1,'cv::viz::isNan(const Point3_< _Tp > &p)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac1c740657f322dea194e709414743e81',1,'isNan(float x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac89eaf4fd08fad1f55e315c0e67acf65',1,'isNan(double x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga0d937e5774fedecb73ea47652f339a02',1,'isNan(const Vec< _Tp, cn > &v)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga1a10dc77396c81df53ad300ea4a426c8',1,'isNan(const Point3_< _Tp > &p)(Global Namespace)']]], + ['isnan_817',['isnan',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a99adfc5178f3fd5488304284388b2a10',1,'Eigen']]], + ['isnd_818',['isND',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a2597ddde56d22b00bc0174978309849b',1,'cv::GMatDesc']]], + ['isnegative_819',['isNegative',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#aabd3e7aebe844034caca4c62dbe9c1eb',1,'Eigen::LDLT']]], + ['isnone_820',['isNone',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a6039b64bf7c1719056f3ef2626d882e1',1,'cv::FileNode']]], + ['isnull_821',['isNull',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a37b401dd265c942c9ef2db1e2b1e56e5',1,'Eigen::AlignedBox']]], + ['isnvidia_822',['isNVidia',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a233ee631d4694cf140100e57a415177b',1,'cv::ocl::Device']]], + ['isoldformatcascade_823',['isOldFormatCascade',['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#aee2b340811fff9aff1770feec7ef7d55',1,'cv::BaseCascadeClassifier::isOldFormatCascade()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a556bdd8738ba96aac07628ec38ff46da',1,'cv::CascadeClassifier::isOldFormatCascade()']]], + ['isometry_824',['Isometry',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaee59a86102f150923b0cac6d4ff05107a84413028615d2d718bafd2dfb93dafef',1,'Eigen::Isometry'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaee59a86102f150923b0cac6d4ff05107a84413028615d2d718bafd2dfb93dafef',1,'Isometry(Global Namespace)']]], + ['isometrytransformtype_825',['IsometryTransformType',['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#ad3ac890d85420ba78e16dab1983d1a80',1,'Eigen::Translation']]], + ['isones_826',['isOnes',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'Eigen::DenseBase::isOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'DenseBase< ArrayWrapper< ExpressionType > >::isOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'DenseBase< Solve< Decomposition, RhsType > >::isOnes()']]], + ['isopen_827',['isOpen',['../classcam_1_1Camera.html#a3a4e701bebbf1664aaa23f9574dae0fb',1,'cam::Camera::isOpen()'],['../classrobot_1_1types_1_1LimitSwitchData.html#ae5a9ddf4a720f8023c6387646b0f8b67',1,'robot::types::LimitSwitchData::isOpen()']]], + ['isopenclactivated_828',['isOpenCLActivated',['https://docs.opencv.org/4.2.0/d5/d96/namespacecv_1_1ocl.html#a587e0f34249ff186739c8df338402aee',1,'cv::ocl']]], + ['isopened_829',['isOpened',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa952c31f4e632595cd5ac107913f4fd1',1,'cv::FileStorage::isOpened()'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a9d2ca36789e7fcfe7a7be3b328038585',1,'cv::VideoCapture::isOpened()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a9a40803e5f671968ac9efa877c984d75',1,'cv::VideoWriter::isOpened()']]], + ['isopenedstream_830',['isOpenedStream',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a365b87a00227198d5835d65bf09ecc81',1,'cv::AVIWriteContainer']]], + ['isorthogonal_831',['isOrthogonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aefdc8e4e4c156fdd79a21479e75dcd8a',1,'Eigen::MatrixBase::isOrthogonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aefdc8e4e4c156fdd79a21479e75dcd8a',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isOrthogonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aefdc8e4e4c156fdd79a21479e75dcd8a',1,'MatrixBase< Solve< Decomposition, RhsType > >::isOrthogonal()']]], + ['isotropicpreconditionerfrompoints_832',['isotropicPreconditionerFromPoints',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga646945dfd23dd78577c04f98441668eb',1,'cv::sfm::isotropicPreconditionerFromPoints()'],['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga646945dfd23dd78577c04f98441668eb',1,'isotropicPreconditionerFromPoints()(Global Namespace)']]], + ['isparseoptflowestimator_833',['ISparseOptFlowEstimator',['https://docs.opencv.org/4.2.0/df/de2/classcv_1_1videostab_1_1ISparseOptFlowEstimator.html',1,'cv::videostab']]], + ['ispositive_834',['isPositive',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a5e1c6b7ba8d7b82575d6ffdc3bf35bcb',1,'Eigen::LDLT']]], + ['ispossiblematch_835',['isPossibleMatch',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#aaeca71427249a189e35e77066f25fc8b',1,'cv::DescriptorMatcher']]], + ['ispowerof2_836',['IsPowerOf2',['https://docs.opencv.org/4.2.0/da/db4/structcv_1_1cudev_1_1IsPowerOf2.html',1,'cv::cudev']]], + ['isprepassdone_5f_837',['isPrePassDone_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a27cb48b75a2390e88af1fa2d8c2f4c28',1,'cv::videostab::TwoPassStabilizer']]], + ['isprint_838',['isprint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acb62bfd8b68d18e2f7902f6bc953b5be',1,'std']]], + ['ispunct_839',['ispunct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a74f97c8b1d25427e90b431e45bfba150',1,'std']]], + ['isreal_840',['isReal',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a19df895cf4d23414e0872ec4f2ab8f94',1,'cv::dnn::DictValue::isReal()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a2b4bb5e70a940bc5543207387923f5aa',1,'cv::FileNode::isReal()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae37527361b2fd69e3d17167629122fea',1,'cv::Scalar_::isReal()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae37527361b2fd69e3d17167629122fea',1,'Scalar_< double >::isReal()']]], + ['isrightnodeleaf_841',['isRightNodeLeaf',['https://docs.opencv.org/4.2.0/df/d88/structHaarFeatureDescriptor32.html#a91d79fdfbd4c4c2ae53f0d33dd989c6a',1,'HaarFeatureDescriptor32']]], + ['isrightof_842',['isRightOf',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a3330f72eb0ace8a8b6faa43c3f606fdd',1,'cv::Subdiv2D']]], + ['isrlmorphologypossible_843',['isRLMorphologyPossible',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga85ed82296e9e9893dcbaa92b87837019',1,'cv::ximgproc::rl::isRLMorphologyPossible()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga85ed82296e9e9893dcbaa92b87837019',1,'isRLMorphologyPossible()(Global Namespace)']]], + ['isrowmajor_844',['IsRowMajor',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da406b6af91d61d348ba1c9764bdd66008',1,'Eigen::DenseBase::IsRowMajor'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da406b6af91d61d348ba1c9764bdd66008',1,'DenseBase< ArrayWrapper< ExpressionType > >::IsRowMajor'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da406b6af91d61d348ba1c9764bdd66008',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::IsRowMajor'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da406b6af91d61d348ba1c9764bdd66008',1,'DenseBase< Solve< Decomposition, RhsType > >::IsRowMajor']]], + ['isrunning_845',['isRunning',['../classutil_1_1AsyncTask.html#a43503af0b5f2252e5921364b3d6671a2',1,'util::AsyncTask']]], + ['isrunninginternal_846',['isRunningInternal',['../classutil_1_1AsyncTask.html#a20bdfa788fbca27e37507bec70d893ee',1,'util::AsyncTask']]], + ['isseparated_847',['isSeparated',['https://docs.opencv.org/4.2.0/d1/dfd/structcv_1_1optflow_1_1GPCPatchDescriptor.html#a9e2fd040535e62051dc84627edb73d4a',1,'cv::optflow::GPCPatchDescriptor']]], + ['isseq_848',['isSeq',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa2671f0a2a477a9f82d73e1bad1f5158',1,'cv::FileNode::isSeq() const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a0bd9a7a631170b4530417b325340624b',1,'cv::FileNode::isSeq(int flags)']]], + ['isspace_849',['isspace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a1adaf858b8edfbfdfcb64f9f6086827e',1,'std']]], + ['isstring_850',['isString',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a196377ee4f1e9e46de495a73ff85eea8',1,'cv::dnn::DictValue::isString()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#abbc622e50535692d0ca5f2e70589a175',1,'cv::FileNode::isString()']]], + ['issubmatrix_851',['isSubmatrix',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7963ba0ea28fcd0f50e5a9218a1e71ba',1,'cv::_InputArray::isSubmatrix()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ab34367822008627e80e144d7bba3bd70',1,'cv::Mat::isSubmatrix()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#acfba13176eea1e0e3db646a4e7a663a5',1,'cv::UMat::isSubmatrix()']]], + ['issubnormal_852',['isSubnormal',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9f1381799912b9539e1841b9ae2e9ed3',1,'cv::softdouble::isSubnormal()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5420ac5bdd327653ee0b90005c5c2b94',1,'cv::softfloat::isSubnormal()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5420ac5bdd327653ee0b90005c5c2b94',1,'isSubnormal() const(Global Namespace)']]], + ['issues_853',['Alignment issues',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__Alignement.html',1,'']]], + ['issurjective_854',['isSurjective',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a87a7d06e0b0479e5b56b19c2a4f56365',1,'Eigen::ColPivHouseholderQR::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a87a7d06e0b0479e5b56b19c2a4f56365',1,'ColPivHouseholderQR< MatrixType >::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a53dd287d3e1bbc548595d63880fd51bf',1,'Eigen::CompleteOrthogonalDecomposition::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aa3593db4708ce9079b0bdf219b99f57e',1,'Eigen::FullPivHouseholderQR::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a1f6222875fc3a181ee1544b9b36dfda5',1,'Eigen::FullPivLU::isSurjective()']]], + ['issymmetric_855',['isSymmetric',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a271b0287c4b2ec235504216f80ab0019',1,'Eigen::SparseLU']]], + ['istargetfg_856',['isTargetFg',['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html#a85d78ac41fa09c670af1e25704167a07',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerAdaBoostingTargetState::isTargetFg()'],['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html#aebf8d19315900b0a6ae42a731588eb5d',1,'cv::TrackerStateEstimatorMILBoosting::TrackerMILTargetState::isTargetFg()']]], + ['isthreadsafe_857',['isThreadSafe',['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a0bcd4038054223f4cda9f6c3eb7e7c11',1,'cv::detail::FeaturesMatcher']]], + ['istilted_858',['isTilted',['https://docs.opencv.org/4.2.0/df/d88/structHaarFeatureDescriptor32.html#a0dfa9fddc7a4c99325a2382c493a5111',1,'HaarFeatureDescriptor32']]], + ['istrackforgotten_859',['isTrackForgotten',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a22a40130f88f9f7fc8110d68cbfc96ce',1,'cv::tbm::ITrackerByMatching']]], + ['istrackvalid_860',['isTrackValid',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#ab0934009b83726268d925bd69ffd65f0',1,'cv::tbm::ITrackerByMatching']]], + ['istrained_861',['isTrained',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#aab380b59eb30b50254ef1b804774c4d8',1,'cv::ml::StatModel']]], + ['istream_862',['istream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00089.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga9a51d9b711a836df9c086f3a5e30b8b2',1,'std::istream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga9a51d9b711a836df9c086f3a5e30b8b2',1,'istream(Global Namespace)']]], + ['istream_2etcc_863',['istream.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00389.html',1,'']]], + ['istream_5fiterator_864',['istream_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07975.html',1,'std::istream_iterator< _Tp, _CharT, _Traits, _Dist >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07975.html#ad21a77186d51771382af6007e650b33c',1,'std::istream_iterator::istream_iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07975.html#a947cfbb26709a887a3e2b47782d8093f',1,'std::istream_iterator::istream_iterator(istream_type &__s)']]], + ['istream_5ftype_865',['istream_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a88fc8fbe18f938ebfad7c496ccafcd76',1,'std::istreambuf_iterator::istream_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a88fc8fbe18f938ebfad7c496ccafcd76',1,'std::istreambuf_iterator::istream_type']]], + ['istreambuf_5fiterator_866',['istreambuf_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html',1,'std::istreambuf_iterator< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a75654a594dd9fd94bcf6712f9c3b8d2c',1,'std::istreambuf_iterator::istreambuf_iterator() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#ac5abfcd042a670b72bdbb2fa3ee0d6f5',1,'std::istreambuf_iterator::istreambuf_iterator(istream_type &__s) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#af53baf53c052a0086f61f54cb4dfa337',1,'std::istreambuf_iterator::istreambuf_iterator(streambuf_type *__s) noexcept']]], + ['istreamsource_867',['IStreamSource',['https://docs.opencv.org/4.2.0/da/d03/classcv_1_1gapi_1_1wip_1_1IStreamSource.html',1,'cv::gapi::wip']]], + ['istringstream_868',['istringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga6d8fb6942dcb39300db6a403f5ba1fe6',1,'std::istringstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga6d8fb6942dcb39300db6a403f5ba1fe6',1,'istringstream(Global Namespace)']]], + ['isumat_869',['isUMat',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7e1555ee58814435df26535ff9380e2e',1,'cv::_InputArray']]], + ['isumat_5f_870',['isUmat_',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#af7da6346b5d17553e15fb312b75e17ac',1,'cv::superres::SuperResolution']]], + ['isumatvector_871',['isUMatVector',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a25688fd401f1f9e1d20f31c7f3c9467e',1,'cv::_InputArray']]], + ['isunaryfunction_872',['IsUnaryFunction',['https://docs.opencv.org/4.2.0/d6/d82/structcv_1_1cudev_1_1IsUnaryFunction.html',1,'cv::cudev']]], + ['isunitary_873',['isUnitary',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a7ee34ce202cac3eeea9cf20c9e4833',1,'Eigen::MatrixBase::isUnitary()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a7ee34ce202cac3eeea9cf20c9e4833',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isUnitary()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a7ee34ce202cac3eeea9cf20c9e4833',1,'MatrixBase< Solve< Decomposition, RhsType > >::isUnitary()']]], + ['isupper_874',['isupper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a50bacb17f1babb86a1239cdc0cf66089',1,'std']]], + ['isuppertriangular_875',['isUpperTriangular',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aae3ec1660bb4ac584220481c54ab4a64',1,'Eigen::MatrixBase::isUpperTriangular()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aae3ec1660bb4ac584220481c54ab4a64',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isUpperTriangular()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aae3ec1660bb4ac584220481c54ab4a64',1,'MatrixBase< Solve< Decomposition, RhsType > >::isUpperTriangular()']]], + ['isvalid_876',['isValid',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a67e9b5fba7b3a70a03db89484aecceb7',1,'cv::TermCriteria::isValid()'],['../classrobot_1_1types_1_1DataPoint.html#a6b0c843157658cd21cfd94808042cd7c',1,'robot::types::DataPoint::isValid()']]], + ['isvaliddepth_877',['isValidDepth',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaec2aff91f8f0600fb7024f57ca9c52c9',1,'cv::rgbd::isValidDepth(const float &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga34e1c9295a7216be59ca4da67d1f5eed',1,'cv::rgbd::isValidDepth(const double &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga74ef1e077263eb737b6349d3d3158f2f',1,'cv::rgbd::isValidDepth(const short int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gafb08f97f37ed0cda66e4f9c47828a0ff',1,'cv::rgbd::isValidDepth(const unsigned short int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga1d690fd424b88e2933705f641c59ac44',1,'cv::rgbd::isValidDepth(const int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga8821699754cadee8a0f04f0622b673c7',1,'cv::rgbd::isValidDepth(const unsigned int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaec2aff91f8f0600fb7024f57ca9c52c9',1,'isValidDepth(const float &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga34e1c9295a7216be59ca4da67d1f5eed',1,'isValidDepth(const double &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga74ef1e077263eb737b6349d3d3158f2f',1,'isValidDepth(const short int &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gafb08f97f37ed0cda66e4f9c47828a0ff',1,'isValidDepth(const unsigned short int &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga1d690fd424b88e2933705f641c59ac44',1,'isValidDepth(const int &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga8821699754cadee8a0f04f0622b673c7',1,'isValidDepth(const unsigned int &depth)(Global Namespace)']]], + ['isvector_878',['isVector',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#ad9a833a610fa8a02d1f840bd6f213086',1,'cv::_InputArray::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'Eigen::SparseMatrixBase::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< Transpose< MatrixType > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::isVector()']]], + ['isvectoratcompiletime_879',['IsVectorAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da1156955c8099c5072934b74c72654ed0',1,'Eigen::DenseBase::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da1156955c8099c5072934b74c72654ed0',1,'DenseBase< ArrayWrapper< ExpressionType > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da1156955c8099c5072934b74c72654ed0',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da1156955c8099c5072934b74c72654ed0',1,'DenseBase< Solve< Decomposition, RhsType > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a14a3f566ed2a074beddb8aef0223bfdf',1,'Eigen::SparseMatrixBase::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a14a3f566ed2a074beddb8aef0223bfdf',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a14a3f566ed2a074beddb8aef0223bfdf',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a14a3f566ed2a074beddb8aef0223bfdf',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a14a3f566ed2a074beddb8aef0223bfdf',1,'SparseMatrixBase< Transpose< MatrixType > >::IsVectorAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a14a3f566ed2a074beddb8aef0223bfdf',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::IsVectorAtCompileTime']]], + ['isvirtual_880',['isvirtual',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a7380e9400279208cdd04ea836f79df8d',1,'cv::Subdiv2D::Vertex']]], + ['isxdigit_881',['isxdigit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2176db62da3573c57096dfe6c2221cb3',1,'std']]], + ['iszero_882',['isZero',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'Eigen::DenseBase::isZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'DenseBase< ArrayWrapper< ExpressionType > >::isZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'DenseBase< Solve< Decomposition, RhsType > >::isZero()']]], + ['it_883',['it',['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html#a0d04ec0b612fc292dd876b55a8bda291',1,'cv::MatCommaInitializer_']]], + ['items_884',['items',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a916a6ba75ec7624e9c6c977a52d6fd17.html#a916a6ba75ec7624e9c6c977a52d6fd17',1,'nlohmann::basic_json::items() noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4faaed730a81347f2f01e93f37c73823.html#a4faaed730a81347f2f01e93f37c73823',1,'nlohmann::basic_json::items() const noexcept']]], + ['iter_5fswap_885',['iter_swap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gad93e66478d9a63e5777733be09931388',1,'std::iter_swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gad93e66478d9a63e5777733be09931388',1,'iter_swap()(Global Namespace)']]], + ['iter_5ftype_886',['iter_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#ae6380ee2883b3ebe0d9aadd2984fd26f',1,'std::money_get::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#ae6380ee2883b3ebe0d9aadd2984fd26f',1,'std::money_get::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a7249c382c88e14da45e08100febe637d',1,'std::money_put::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a7249c382c88e14da45e08100febe637d',1,'std::money_put::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a54c3ce0bfdb7fb56c3ffe09b355fdefb',1,'std::num_get::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a54c3ce0bfdb7fb56c3ffe09b355fdefb',1,'std::num_get::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ad2381689c28b46237f7615e0de6028fa',1,'std::num_put::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ad2381689c28b46237f7615e0de6028fa',1,'std::num_put::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a4d4958640ecfa742e7d27137de746ac1',1,'std::time_get::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a4d4958640ecfa742e7d27137de746ac1',1,'std::time_get::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#aaac7d8b45c25d36c14efe8876af1d65e',1,'std::time_put::iter_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#aaac7d8b45c25d36c14efe8876af1d65e',1,'std::time_put::iter_type']]], + ['iterate_887',['iterate',['https://docs.opencv.org/4.2.0/d5/da0/classcv_1_1ximgproc_1_1SuperpixelLSC.html#a651e84e8a99145df8b560858d1fa070b',1,'cv::ximgproc::SuperpixelLSC::iterate()'],['https://docs.opencv.org/4.2.0/df/d81/classcv_1_1ximgproc_1_1SuperpixelSEEDS.html#afc35736ae52b277a1708b54037598cbb',1,'cv::ximgproc::SuperpixelSEEDS::iterate()'],['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1ximgproc_1_1SuperpixelSLIC.html#add5e65da972e5e00ce1753ea862f380c',1,'cv::ximgproc::SuperpixelSLIC::iterate()']]], + ['iterationinit_888',['iterationInit',['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#ad0d03e8efe6f76c284d075536ae4adde',1,'cv::TrackerBoosting::Params']]], + ['iterationnum_889',['iterationNum',['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html#a4190f430eee681b7ce043994f5d867bb',1,'cv::TrackerSamplerPF::Params']]], + ['iterations_890',['iterations',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#ae778dd098bd5e6655625b20b1e9f15da',1,'Eigen::IterativeSolverBase::iterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#afbecc6d0ab1de42be9db79428da48ab6',1,'Eigen::RealQZ::iterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#afbecc6d0ab1de42be9db79428da48ab6',1,'RealQZ< MatrixType >::iterations()']]], + ['iterative_891',['ITERATIVE',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#gga6a4ee3a5f9fd35c1b350a1049d8abc9da42216ed5e5593d09ba0a26576061c33f',1,'cv::ft::ITERATIVE'],['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#gga6a4ee3a5f9fd35c1b350a1049d8abc9da42216ed5e5593d09ba0a26576061c33f',1,'ITERATIVE(Global Namespace)']]], + ['iterativelinearsolvers_20module_892',['IterativeLinearSolvers module',['https://eigen.tuxfamily.org/dox/group__IterativeLinearSolvers__Module.html',1,'']]], + ['iterativesolverbase_893',['IterativeSolverBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html',1,'Eigen::IterativeSolverBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a0922f2be45082690d7734aa6732fc493',1,'Eigen::IterativeSolverBase::IterativeSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a3c68fe3cd929ea1ff8a0d4cbcd65ebad',1,'Eigen::IterativeSolverBase::IterativeSolverBase(const EigenBase< MatrixDerived > &A)']]], + ['iterator_894',['iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11935.html',1,'__gnu_pbds::detail::pat_trie_base::_Inode< _ATraits, Metadata >::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09895.html',1,'std::experimental::filesystem::v1::path::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'std::iterator< _Category, _Tp, _Distance, _Pointer, _Reference >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00092.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a04a2e3cf31e6396607ab6d18be91fd61',1,'cv::Mat_::iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a04a2e3cf31e6396607ab6d18be91fd61',1,'Mat_< double >::iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a04a2e3cf31e6396607ab6d18be91fd61',1,'Mat_< float >::iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a04a2e3cf31e6396607ab6d18be91fd61',1,'Mat_< uchar >::iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a04a2e3cf31e6396607ab6d18be91fd61',1,'Mat_< unsigned char >::iterator'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#aa766accd9ac415bea90019010f58cac6',1,'cv::SparseMat::iterator'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#aad69108f160c710a9e39e540790cd630',1,'cv::SparseMat_::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab67be28282428ca9d7bd2f77a5507c1a',1,'std::set::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab67be28282428ca9d7bd2f77a5507c1a',1,'std::set::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0526d137ece77ce98d550cd2d6fd1816',1,'std::unordered_map::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0526d137ece77ce98d550cd2d6fd1816',1,'std::unordered_map::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a0fffce26090303390cc7fce06b5f6615',1,'std::unordered_multimap::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a0fffce26090303390cc7fce06b5f6615',1,'std::unordered_multimap::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ad30c938c0f7a7d7d78471da27420efc0',1,'std::unordered_multiset::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ad30c938c0f7a7d7d78471da27420efc0',1,'std::unordered_multiset::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a02fe876578c29d71f3b0e63ae959fc9e',1,'std::unordered_set::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a02fe876578c29d71f3b0e63ae959fc9e',1,'std::unordered_set::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0526d137ece77ce98d550cd2d6fd1816',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0526d137ece77ce98d550cd2d6fd1816',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af5130902770642a1a057a99c397d357d',1,'Eigen::DenseBase::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af5130902770642a1a057a99c397d357d',1,'DenseBase< ArrayWrapper< ExpressionType > >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af5130902770642a1a057a99c397d357d',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af5130902770642a1a057a99c397d357d',1,'DenseBase< Solve< Decomposition, RhsType > >::iterator'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa549b2b382916b3baafb526e5cb410bd.html#aa549b2b382916b3baafb526e5cb410bd',1,'nlohmann::basic_json::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'Eigen::VectorwiseOp::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const Derived, Horizontal >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const Derived, Vertical >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9fb8aaf24528efcdac1782aacf99b8dd',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::iterator']]], + ['iterator_20tags_895',['Iterator Tags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01514.html',1,'']]], + ['iterator_2eh_896',['iterator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00908.html',1,'']]], + ['iterator_2ehpp_897',['iterator.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01460.html',1,'']]], + ['iterator_3c_20input_5fiterator_5ftag_2c_20_5fchart_2c_20_5ftraits_3a_3aoff_5ftype_2c_20_5fchart_20_2a_2c_20_5fchart_20_3e_898',['iterator< input_iterator_tag, _CharT, _Traits::off_type, _CharT *, _CharT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], + ['iterator_3c_20input_5fiterator_5ftag_2c_20_5ftp_2c_20_5fdist_2c_20const_20_5ftp_20_2a_2c_20const_20_5ftp_20_26_20_3e_899',['iterator< input_iterator_tag, _Tp, _Dist, const _Tp *, const _Tp & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], + ['iterator_3c_20iterator_5ftraits_3c_20_5fiterator_20_3e_3a_3aiterator_5fcategory_2c_20iterator_5ftraits_3c_20_5fiterator_20_3e_3a_3avalue_5ftype_2c_20iterator_5ftraits_3c_20_5fiterator_20_3e_3a_3adifference_5ftype_2c_20iterator_5ftraits_3c_20_5fiterator_20_3e_3a_3apointer_2c_20iterator_5ftraits_3c_20_5fiterator_20_3e_3a_3areference_20_3e_900',['iterator< iterator_traits< _Iterator >::iterator_category, iterator_traits< _Iterator >::value_type, iterator_traits< _Iterator >::difference_type, iterator_traits< _Iterator >::pointer, iterator_traits< _Iterator >::reference >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], + ['iterator_3c_20output_5fiterator_5ftag_2c_20void_2c_20void_2c_20void_2c_20void_20_3e_901',['iterator< output_iterator_tag, void, void, void, void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], + ['iterator_3c_20std_3a_3aoutput_5fiterator_5ftag_2c_20void_2c_20void_2c_20void_2c_20void_20_3e_902',['iterator< std::output_iterator_tag, void, void, void, void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], + ['iterator_3c_20std_3a_3arandom_5faccess_5fiterator_5ftag_2c_20_5fchart_20_3e_903',['iterator< std::random_access_iterator_tag, _CharT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], + ['iterator_3c_20std_3a_3arandom_5faccess_5fiterator_5ftag_2c_20bool_20_3e_904',['iterator< std::random_access_iterator_tag, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html',1,'']]], + ['iterator_5f_905',['iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html',1,'iterator_'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a53fb6c07d7d3153087d79ca22c1a8ec0',1,'iterator_::iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a43fbe36e902b02465f9cd20a69cbd9a4',1,'iterator_::iterator_(pointer p_value, PB_DS_GEN_POS pos, PB_DS_CLASS_C_DEC *p_tbl)']]], + ['iterator_5fcategory_906',['iterator_category',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#abe9ccc65ff06227d9d3a22f6540d164f',1,'cv::MatConstIterator::iterator_category'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a982c1f3b60466325f8156197ed4d52b8',1,'cv::MatConstIterator_::iterator_category'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a44c7cc2143ee5600a2e4d2a62e27278d',1,'cv::MatIterator_::iterator_category'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a72422dbb0a1afd0045309aeab95cdbd7',1,'cv::SparseMatConstIterator_::iterator_category'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a032fb509c53ad44f22ae833876dd113f',1,'cv::SparseMatIterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#ae7cdc704c64581039293828b5c6f4b15',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#ae7cdc704c64581039293828b5c6f4b15',1,'__gnu_pbds::detail::bin_search_tree_node_it_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#aac3f2af936b4120fe980c2d7075dd6f4',1,'__gnu_pbds::detail::binary_heap_const_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a0d1b6774adedb170ee1ed23fcff30ba2',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#abfb76ff099663b004647df58f5caea7a',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#ad578e2244dc434c3efe2c432b2ed6e49',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#af444809607ea316622a983fcd8b9e1d3',1,'const_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< input_iterator_tag, _CharT, _Traits::off_type, _CharT *, _CharT >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< input_iterator_tag, _Tp, _Dist, const _Tp *, const _Tp & >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< iterator_traits< _Iterator >::iterator_category, iterator_traits< _Iterator >::value_type, iterator_traits< _Iterator >::difference_type, iterator_traits< _Iterator >::pointer, iterator_traits< _Iterator >::reference >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< output_iterator_tag, void, void, void, void >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< std::output_iterator_tag, void, void, void, void >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< std::random_access_iterator_tag, _CharT >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'iterator< std::random_access_iterator_tag, bool >::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a304ce8f2d8163bcd83c095521b6fa1b1',1,'iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#ac5b6dc54bff59e85201e0c4c6c3cd412',1,'point_const_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#abe8100b521572dbff3f33d9a4d7779eb',1,'point_iterator_::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::back_insert_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::front_insert_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::insert_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::istream_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::istreambuf_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::ostream_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::ostreambuf_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::raw_storage_iterator::iterator_category'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a3d32527bfebba5c0459df1390cef50a9',1,'std::reverse_iterator::iterator_category']]], + ['iterator_5ffn_5fimps_2ehpp_907',['iterator_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01307.html',1,'']]], + ['iterator_5ftracker_2eh_908',['iterator_tracker.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00815.html',1,'']]], + ['iterator_5ftraits_3c_20_5ftp_20_2a_20_3e_909',['iterator_traits< _Tp * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07727.html',1,'std']]], + ['iterator_5ftraits_3c_20const_20_5ftp_20_2a_20_3e_910',['iterator_traits< const _Tp * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07731.html',1,'std']]], + ['iterator_5fwrapper_911',['iterator_wrapper',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a22e2e5b0e68d9d7c63be2cada5187259.html#a22e2e5b0e68d9d7c63be2cada5187259',1,'nlohmann::basic_json::iterator_wrapper(reference ref) noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3710ff8c5a1cbedb4f75b700a8962d5c.html#a3710ff8c5a1cbedb4f75b700a8962d5c',1,'nlohmann::basic_json::iterator_wrapper(const_reference ref) noexcept']]], + ['iterators_912',['Iterators',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html',1,'']]], + ['iterators_20and_20algorithms_913',['STL iterators and algorithms',['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'']]], + ['itercounts_914',['iterCounts',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a3e2e55b3264b1b95746f0f2b9cba9cb2',1,'cv::rgbd::FastICPOdometry::iterCounts'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a9e00bb579d842cc1860aea11cebdd8a1',1,'cv::rgbd::ICPOdometry::iterCounts'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a7629d0bb783e2a749ae8ace23ac92b06',1,'cv::rgbd::RgbdICPOdometry::iterCounts'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#ac4eb3320bb05a5ae2c55c05072f728ff',1,'cv::rgbd::RgbdOdometry::iterCounts']]], + ['iterdepth_915',['iterdepth',['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a12f058bd6c7ea7e2b87c65eaa3054e0e',1,'cv::NAryMatIterator']]], + ['itrackerbymatching_916',['ITrackerByMatching',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html',1,'cv::tbm']]], + ['its_20use_20for_20image_20processing_917',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], + ['iword_918',['iword',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_ios< char, _Traits >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_iostream< char >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_istream< char >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_istream< char, _Traits >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_ostream< char >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_ostream< char, _Traits >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_fstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ifstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ios::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_iostream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_istream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_istringstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ofstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ostream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ostringstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_stringstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::ios_base::iword()']]], + ['iwriter_919',['iwriter',['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#ab6567d64fd202fe34284f0b11b79454c',1,'cv::VideoWriter']]], + ['iwscale_920',['iwscale',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a097562f84bb9d6a6bf28f53369fc26c2',1,'cv::ocl::KernelArg']]] ]; diff --git a/search/all_13.js b/search/all_13.js index c7128958..085e1635 100644 --- a/search/all_13.js +++ b/search/all_13.js @@ -4,79 +4,78 @@ var searchData= ['jacobianposcontroller_1',['JacobianPosController',['../classcontrol_1_1JacobianPosController.html',1,'control::JacobianPosController< outputDim, inputDim >'],['../classcontrol_1_1JacobianPosController.html#a176b03c5cda298cd959ab7cbe202f9d6',1,'control::JacobianPosController::JacobianPosController()']]], ['jacobianvelcontroller_2',['JacobianVelController',['../classJacobianVelController.html',1,'JacobianVelController< outputDim, inputDim >'],['../classJacobianVelController.html#a5650988ffe8c47a8d3b6400fdd116b23',1,'JacobianVelController::JacobianVelController()']]], ['jacobirotation_3',['JacobiRotation',['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html',1,'Eigen::JacobiRotation< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html#a38fec2c4da529ef3d05ff37b848b4227',1,'Eigen::JacobiRotation::JacobiRotation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html#a3e8b5dc0a56f7a2d0f788b1ccb1547cb',1,'Eigen::JacobiRotation::JacobiRotation(const Scalar &c, const Scalar &s)']]], - ['jacobisvd_4',['JacobiSVD',['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html',1,'Eigen']]], + ['jacobisvd_4',['JacobiSVD',['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html',1,'Eigen::JacobiSVD< class, QRPreconditioner >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a55315ab9cd060019a5ad07be798ff3b9',1,'Eigen::JacobiSVD::JacobiSVD()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#abfd1dd454a6e3edec7feecd97c818a78',1,'Eigen::JacobiSVD::JacobiSVD(const MatrixType &matrix, unsigned int computationOptions=0)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a5d9ea7c8f361337727260efd77ee03ac',1,'Eigen::JacobiSVD::JacobiSVD(Index rows, Index cols, unsigned int computationOptions=0)']]], ['jacobisvd_5',['jacobiSvd',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5745dca9c54390633b434e54a1d1eedd',1,'Eigen::MatrixBase::jacobiSvd()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5745dca9c54390633b434e54a1d1eedd',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::jacobiSvd()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5745dca9c54390633b434e54a1d1eedd',1,'MatrixBase< Solve< Decomposition, RhsType > >::jacobiSvd()']]], - ['jacobisvd_6',['JacobiSVD',['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a55315ab9cd060019a5ad07be798ff3b9',1,'Eigen::JacobiSVD::JacobiSVD()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#abfd1dd454a6e3edec7feecd97c818a78',1,'Eigen::JacobiSVD::JacobiSVD(const MatrixType &matrix, unsigned int computationOptions=0)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a5d9ea7c8f361337727260efd77ee03ac',1,'Eigen::JacobiSVD::JacobiSVD(Index rows, Index cols, unsigned int computationOptions=0)']]], - ['java_20development_7',['Introduction to Java Development',['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'']]], - ['java_20with_20eclipse_8',['Using OpenCV Java with Eclipse',['https://docs.opencv.org/4.2.0/d1/d0a/tutorial_java_eclipse.html',1,'']]], - ['java_5fdev_5fintro_2emarkdown_9',['java_dev_intro.markdown',['https://docs.opencv.org/4.2.0/d0/d80/java__dev__intro_8markdown.html',1,'']]], - ['java_5feclipse_2emarkdown_10',['java_eclipse.markdown',['https://docs.opencv.org/4.2.0/d0/d9c/java__eclipse_8markdown.html',1,'']]], - ['jflushstream_11',['jflushStream',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#ad727ab9c530b7f85bf5cf455d5ea95c9',1,'cv::AVIWriteContainer']]], - ['join_12',['join',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html',1,'cv::datasets::join'],['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#abd0ef8c83e77e143081b83a953492c7a',1,'cv::utils::fs::join()']]], - ['join_5ferror_13',['join_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11135.html',1,'__gnu_pbds']]], - ['jointbilateralfilter_14',['jointBilateralFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga80b9b58fb85dd069691b709285ab985c',1,'cv::ximgproc::jointBilateralFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga80b9b58fb85dd069691b709285ab985c',1,'jointBilateralFilter()(Global Namespace)']]], - ['jointpos_5ft_15',['jointpos_t',['../structkinematics_1_1jointpos__t.html',1,'kinematics::jointpos_t'],['../structkinematics_1_1jointpos__t.html#a2ea69a1352983c26a870f9174383f2e0',1,'kinematics::jointpos_t::jointpos_t()']]], - ['jointpostoeepos_16',['jointPosToEEPos',['../classkinematics_1_1ArmKinematics.html#adf327ec70f90af5be495ef6d3548f635',1,'kinematics::ArmKinematics::jointPosToEEPos()'],['../classkinematics_1_1ForwardArmKinematics.html#a47a36808da40060b9ea54e9bd11f8dcb',1,'kinematics::ForwardArmKinematics::jointPosToEEPos()'],['../classkinematics_1_1PlanarArmFK.html#a1cf21a7144d19e592158aa7c7a0c3088',1,'kinematics::PlanarArmFK::jointPosToEEPos()']]], - ['jointpostogearpos_17',['jointPosToGearPos',['../classkinematics_1_1DiffWristKinematics.html#a06cd252697b0207ef5c27755b09c1b2f',1,'kinematics::DiffWristKinematics']]], - ['jointpowertogearpower_18',['jointPowerToGearPower',['../classkinematics_1_1DiffWristKinematics.html#a1c86d2d09536cd3bcfb3d6a3eaf0224c',1,'kinematics::DiffWristKinematics']]], - ['jointveltoeevel_19',['jointVelToEEVel',['../classkinematics_1_1ForwardArmKinematics.html#a5d53ca2a45246ec499e11aec1cd520e5',1,'kinematics::ForwardArmKinematics']]], - ['jpeg_20',['JPEG',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a766712d578e6a32b7def99fb0e17ae4c',1,'cv::cudacodec::JPEG'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a766712d578e6a32b7def99fb0e17ae4c',1,'JPEG(Global Namespace)']]], - ['jputstream_21',['jputStream',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a036e1bdfec50b0ad0113a1e3decbe0f1',1,'cv::AVIWriteContainer']]], - ['jputstreamshort_22',['jputStreamShort',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a46b2c58f0c6a4af5c9af2351c2be34fd',1,'cv::AVIWriteContainer']]], - ['js_23',['js',['https://docs.opencv.org/4.2.0/d4/da1/tutorial_js_setup.html',1,'Build OpenCV.js'],['https://docs.opencv.org/4.2.0/d0/d43/tutorial_js_table_of_contents_contours.html',1,'Contours in OpenCV.js'],['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'Histograms in OpenCV.js'],['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'Image Transforms in OpenCV.js'],['https://docs.opencv.org/4.2.0/df/df7/tutorial_js_table_of_contents_setup.html',1,'Introduction to OpenCV.js'],['https://docs.opencv.org/4.2.0/d0/d84/tutorial_js_usage.html',1,'Using OpenCV.js']]], - ['js_20and_20tutorials_24',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], - ['js_20in_20node_20js_25',['Using OpenCV.js In Node.js',['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'']]], - ['js_20tutorials_26',['OpenCV.js Tutorials',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_js_root.html',1,'']]], - ['js_5fbasic_5fops_2emarkdown_27',['js_basic_ops.markdown',['https://docs.opencv.org/4.2.0/da/d5f/js__basic__ops_8markdown.html',1,'']]], - ['js_5fbg_5fsubtraction_2emarkdown_28',['js_bg_subtraction.markdown',['https://docs.opencv.org/4.2.0/d9/d54/js__bg__subtraction_8markdown.html',1,'']]], - ['js_5fcanny_2emarkdown_29',['js_canny.markdown',['https://docs.opencv.org/4.2.0/d5/da5/js__canny_8markdown.html',1,'']]], - ['js_5fcolorspaces_2emarkdown_30',['js_colorspaces.markdown',['https://docs.opencv.org/4.2.0/da/d3b/js__colorspaces_8markdown.html',1,'']]], - ['js_5fcontour_5ffeatures_2emarkdown_31',['js_contour_features.markdown',['https://docs.opencv.org/4.2.0/dc/d73/js__contour__features_8markdown.html',1,'']]], - ['js_5fcontour_5fproperties_2emarkdown_32',['js_contour_properties.markdown',['https://docs.opencv.org/4.2.0/d2/da4/js__contour__properties_8markdown.html',1,'']]], - ['js_5fcontours_5fbegin_2emarkdown_33',['js_contours_begin.markdown',['https://docs.opencv.org/4.2.0/d3/d40/js__contours__begin_8markdown.html',1,'']]], - ['js_5fcontours_5fhierarchy_2emarkdown_34',['js_contours_hierarchy.markdown',['https://docs.opencv.org/4.2.0/db/dc1/js__contours__hierarchy_8markdown.html',1,'']]], - ['js_5fcontours_5fmore_5ffunctions_2emarkdown_35',['js_contours_more_functions.markdown',['https://docs.opencv.org/4.2.0/da/d53/js__contours__more__functions_8markdown.html',1,'']]], - ['js_5fface_5fdetection_2emarkdown_36',['js_face_detection.markdown',['https://docs.opencv.org/4.2.0/dd/d6a/js__face__detection_8markdown.html',1,'']]], - ['js_5fface_5fdetection_5fcamera_2emarkdown_37',['js_face_detection_camera.markdown',['https://docs.opencv.org/4.2.0/d9/dc3/js__face__detection__camera_8markdown.html',1,'']]], - ['js_5ffiltering_2emarkdown_38',['js_filtering.markdown',['https://docs.opencv.org/4.2.0/d8/d93/js__filtering_8markdown.html',1,'']]], - ['js_5ffourier_5ftransform_2emarkdown_39',['js_fourier_transform.markdown',['https://docs.opencv.org/4.2.0/df/d99/js__fourier__transform_8markdown.html',1,'']]], - ['js_5fgeometric_5ftransformations_2emarkdown_40',['js_geometric_transformations.markdown',['https://docs.opencv.org/4.2.0/d3/d3b/js__geometric__transformations_8markdown.html',1,'']]], - ['js_5fgrabcut_2emarkdown_41',['js_grabcut.markdown',['https://docs.opencv.org/4.2.0/d2/ddc/js__grabcut_8markdown.html',1,'']]], - ['js_5fgradients_2emarkdown_42',['js_gradients.markdown',['https://docs.opencv.org/4.2.0/d8/d7c/js__gradients_8markdown.html',1,'']]], - ['js_5fhistogram_5fbackprojection_2emarkdown_43',['js_histogram_backprojection.markdown',['https://docs.opencv.org/4.2.0/da/d92/js__histogram__backprojection_8markdown.html',1,'']]], - ['js_5fhistogram_5fbegins_2emarkdown_44',['js_histogram_begins.markdown',['https://docs.opencv.org/4.2.0/d8/d45/js__histogram__begins_8markdown.html',1,'']]], - ['js_5fhistogram_5fequalization_2emarkdown_45',['js_histogram_equalization.markdown',['https://docs.opencv.org/4.2.0/dc/dbf/js__histogram__equalization_8markdown.html',1,'']]], - ['js_5fhoughcircles_2emarkdown_46',['js_houghcircles.markdown',['https://docs.opencv.org/4.2.0/d1/d4b/js__houghcircles_8markdown.html',1,'']]], - ['js_5fhoughlines_2emarkdown_47',['js_houghlines.markdown',['https://docs.opencv.org/4.2.0/d0/df9/js__houghlines_8markdown.html',1,'']]], - ['js_5fimage_5farithmetics_2emarkdown_48',['js_image_arithmetics.markdown',['https://docs.opencv.org/4.2.0/de/df1/js__image__arithmetics_2js__image__arithmetics_8markdown.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d93/js__some__data__structures_2js__image__arithmetics_8markdown.html',1,'(Global Namespace)']]], - ['js_5fimage_5fdisplay_2emarkdown_49',['js_image_display.markdown',['https://docs.opencv.org/4.2.0/d6/d6a/js__image__display_8markdown.html',1,'']]], - ['js_5fimgproc_5fcamera_2emarkdown_50',['js_imgproc_camera.markdown',['https://docs.opencv.org/4.2.0/d7/db4/js__imgproc__camera_8markdown.html',1,'']]], - ['js_5fintro_2emarkdown_51',['js_intro.markdown',['https://docs.opencv.org/4.2.0/d6/d50/js__intro_8markdown.html',1,'']]], - ['js_5flucas_5fkanade_2emarkdown_52',['js_lucas_kanade.markdown',['https://docs.opencv.org/4.2.0/dd/d67/js__lucas__kanade_8markdown.html',1,'']]], - ['js_5fmeanshift_2emarkdown_53',['js_meanshift.markdown',['https://docs.opencv.org/4.2.0/d8/d53/js__meanshift_8markdown.html',1,'']]], - ['js_5fmorphological_5fops_2emarkdown_54',['js_morphological_ops.markdown',['https://docs.opencv.org/4.2.0/db/dc8/js__morphological__ops_8markdown.html',1,'']]], - ['js_5fnodejs_2emarkdown_55',['js_nodejs.markdown',['https://docs.opencv.org/4.2.0/d9/d61/js__nodejs_8markdown.html',1,'']]], - ['js_5fpyramids_2emarkdown_56',['js_pyramids.markdown',['https://docs.opencv.org/4.2.0/db/dee/js__pyramids_8markdown.html',1,'']]], - ['js_5fsetup_2emarkdown_57',['js_setup.markdown',['https://docs.opencv.org/4.2.0/d1/df5/js__setup_8markdown.html',1,'']]], - ['js_5ftable_5fof_5fcontents_5fcontours_2emarkdown_58',['js_table_of_contents_contours.markdown',['https://docs.opencv.org/4.2.0/d5/dee/js__table__of__contents__contours_8markdown.html',1,'']]], - ['js_5ftable_5fof_5fcontents_5fcore_2emarkdown_59',['js_table_of_contents_core.markdown',['https://docs.opencv.org/4.2.0/d2/dac/js__table__of__contents__core_8markdown.html',1,'']]], - ['js_5ftable_5fof_5fcontents_5fgui_2emarkdown_60',['js_table_of_contents_gui.markdown',['https://docs.opencv.org/4.2.0/d3/dea/js__table__of__contents__gui_8markdown.html',1,'']]], - ['js_5ftable_5fof_5fcontents_5fhistograms_2emarkdown_61',['js_table_of_contents_histograms.markdown',['https://docs.opencv.org/4.2.0/d3/d12/js__table__of__contents__histograms_8markdown.html',1,'']]], - ['js_5ftable_5fof_5fcontents_5fimgproc_2emarkdown_62',['js_table_of_contents_imgproc.markdown',['https://docs.opencv.org/4.2.0/de/d34/js__table__of__contents__imgproc_8markdown.html',1,'']]], - ['js_5ftable_5fof_5fcontents_5fobjdetect_2emarkdown_63',['js_table_of_contents_objdetect.markdown',['https://docs.opencv.org/4.2.0/d5/d35/js__table__of__contents__objdetect_8markdown.html',1,'']]], - ['js_5ftable_5fof_5fcontents_5fsetup_2emarkdown_64',['js_table_of_contents_setup.markdown',['https://docs.opencv.org/4.2.0/d7/d0a/js__table__of__contents__setup_8markdown.html',1,'']]], - ['js_5ftable_5fof_5fcontents_5ftransforms_2emarkdown_65',['js_table_of_contents_transforms.markdown',['https://docs.opencv.org/4.2.0/d9/ddb/js__table__of__contents__transforms_8markdown.html',1,'']]], - ['js_5ftable_5fof_5fcontents_5fvideo_2emarkdown_66',['js_table_of_contents_video.markdown',['https://docs.opencv.org/4.2.0/df/d34/js__table__of__contents__video_8markdown.html',1,'']]], - ['js_5ftemplate_5fmatching_2emarkdown_67',['js_template_matching.markdown',['https://docs.opencv.org/4.2.0/d3/d94/js__template__matching_8markdown.html',1,'']]], - ['js_5fthresholding_2emarkdown_68',['js_thresholding.markdown',['https://docs.opencv.org/4.2.0/d1/dbe/js__thresholding_8markdown.html',1,'']]], - ['js_5ftrackbar_2emarkdown_69',['js_trackbar.markdown',['https://docs.opencv.org/4.2.0/d6/d28/js__trackbar_8markdown.html',1,'']]], - ['js_5ftutorials_2emarkdown_70',['js_tutorials.markdown',['https://docs.opencv.org/4.2.0/dc/d49/js__tutorials_8markdown.html',1,'']]], - ['js_5fusage_2emarkdown_71',['js_usage.markdown',['https://docs.opencv.org/4.2.0/d3/d0f/js__usage_8markdown.html',1,'']]], - ['js_5fvideo_5fdisplay_2emarkdown_72',['js_video_display.markdown',['https://docs.opencv.org/4.2.0/de/d0f/js__video__display_8markdown.html',1,'']]], - ['js_5fwatershed_2emarkdown_73',['js_watershed.markdown',['https://docs.opencv.org/4.2.0/d4/d13/js__watershed_8markdown.html',1,'']]], - ['json_74',['json',['https://nlohmann.github.io/json/doxygen/namespacenlohmann_a2bfd99e845a2e5cd90aeaf1b1431f474.html#a2bfd99e845a2e5cd90aeaf1b1431f474',1,'nlohmann']]], - ['json_5fpointer_75',['json_pointer',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer.html',1,'nlohmann::json_pointer< class >'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa8f1f93b32da01b42413643be32b2c27.html#aa8f1f93b32da01b42413643be32b2c27',1,'nlohmann::basic_json::json_pointer'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a7f32d7c62841f0c4a6784cf741a6e4f8.html#a7f32d7c62841f0c4a6784cf741a6e4f8',1,'nlohmann::json_pointer::json_pointer()']]], - ['json_5fsax_76',['json_sax',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax.html',1,'nlohmann::json_sax< class >'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_aac0f445c1173fa731104d93496a7e780.html#aac0f445c1173fa731104d93496a7e780',1,'nlohmann::json_sax::json_sax()=default'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a8358c063b2d7222b3aafa62fded04403.html#a8358c063b2d7222b3aafa62fded04403',1,'nlohmann::json_sax::json_sax(const json_sax &)=default'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a62dae3713ca4914265904e30cd6b6347.html#a62dae3713ca4914265904e30cd6b6347',1,'nlohmann::json_sax::json_sax(json_sax &&) noexcept=default']]], - ['json_5fsax_5ft_77',['json_sax_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a164b1094a1a9feb54e400d8510bb0b12.html#a164b1094a1a9feb54e400d8510bb0b12',1,'nlohmann::basic_json']]], - ['json_5fserializer_78',['json_serializer',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad6ebc5da7ced975bb184133750e7d49f.html#ad6ebc5da7ced975bb184133750e7d49f',1,'nlohmann::basic_json']]] + ['java_20development_6',['Introduction to Java Development',['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'']]], + ['java_20with_20eclipse_7',['Using OpenCV Java with Eclipse',['https://docs.opencv.org/4.2.0/d1/d0a/tutorial_java_eclipse.html',1,'']]], + ['java_5fdev_5fintro_2emarkdown_8',['java_dev_intro.markdown',['https://docs.opencv.org/4.2.0/d0/d80/java__dev__intro_8markdown.html',1,'']]], + ['java_5feclipse_2emarkdown_9',['java_eclipse.markdown',['https://docs.opencv.org/4.2.0/d0/d9c/java__eclipse_8markdown.html',1,'']]], + ['jflushstream_10',['jflushStream',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#ad727ab9c530b7f85bf5cf455d5ea95c9',1,'cv::AVIWriteContainer']]], + ['join_11',['join',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html',1,'cv::datasets::join'],['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#abd0ef8c83e77e143081b83a953492c7a',1,'cv::utils::fs::join()']]], + ['join_5ferror_12',['join_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11135.html',1,'__gnu_pbds']]], + ['jointbilateralfilter_13',['jointBilateralFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga80b9b58fb85dd069691b709285ab985c',1,'cv::ximgproc::jointBilateralFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga80b9b58fb85dd069691b709285ab985c',1,'jointBilateralFilter()(Global Namespace)']]], + ['jointpos_5ft_14',['jointpos_t',['../structkinematics_1_1jointpos__t.html',1,'kinematics::jointpos_t'],['../structkinematics_1_1jointpos__t.html#a2ea69a1352983c26a870f9174383f2e0',1,'kinematics::jointpos_t::jointpos_t()']]], + ['jointpostoeepos_15',['jointPosToEEPos',['../classkinematics_1_1ArmKinematics.html#adf327ec70f90af5be495ef6d3548f635',1,'kinematics::ArmKinematics::jointPosToEEPos()'],['../classkinematics_1_1ForwardArmKinematics.html#a47a36808da40060b9ea54e9bd11f8dcb',1,'kinematics::ForwardArmKinematics::jointPosToEEPos()'],['../classkinematics_1_1PlanarArmFK.html#a1cf21a7144d19e592158aa7c7a0c3088',1,'kinematics::PlanarArmFK::jointPosToEEPos()']]], + ['jointpostogearpos_16',['jointPosToGearPos',['../classkinematics_1_1DiffWristKinematics.html#a06cd252697b0207ef5c27755b09c1b2f',1,'kinematics::DiffWristKinematics']]], + ['jointpowertogearpower_17',['jointPowerToGearPower',['../classkinematics_1_1DiffWristKinematics.html#a1c86d2d09536cd3bcfb3d6a3eaf0224c',1,'kinematics::DiffWristKinematics']]], + ['jointveltoeevel_18',['jointVelToEEVel',['../classkinematics_1_1ForwardArmKinematics.html#a5d53ca2a45246ec499e11aec1cd520e5',1,'kinematics::ForwardArmKinematics']]], + ['jpeg_19',['JPEG',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a766712d578e6a32b7def99fb0e17ae4c',1,'cv::cudacodec::JPEG'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a766712d578e6a32b7def99fb0e17ae4c',1,'JPEG(Global Namespace)']]], + ['jputstream_20',['jputStream',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a036e1bdfec50b0ad0113a1e3decbe0f1',1,'cv::AVIWriteContainer']]], + ['jputstreamshort_21',['jputStreamShort',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a46b2c58f0c6a4af5c9af2351c2be34fd',1,'cv::AVIWriteContainer']]], + ['js_22',['js',['https://docs.opencv.org/4.2.0/d4/da1/tutorial_js_setup.html',1,'Build OpenCV.js'],['https://docs.opencv.org/4.2.0/d0/d43/tutorial_js_table_of_contents_contours.html',1,'Contours in OpenCV.js'],['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'Histograms in OpenCV.js'],['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'Image Transforms in OpenCV.js'],['https://docs.opencv.org/4.2.0/df/df7/tutorial_js_table_of_contents_setup.html',1,'Introduction to OpenCV.js'],['https://docs.opencv.org/4.2.0/d0/d84/tutorial_js_usage.html',1,'Using OpenCV.js'],['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'Using OpenCV.js In Node.js']]], + ['js_20and_20tutorials_23',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], + ['js_20in_20node_20js_24',['Using OpenCV.js In Node.js',['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'']]], + ['js_20tutorials_25',['OpenCV.js Tutorials',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_js_root.html',1,'']]], + ['js_5fbasic_5fops_2emarkdown_26',['js_basic_ops.markdown',['https://docs.opencv.org/4.2.0/da/d5f/js__basic__ops_8markdown.html',1,'']]], + ['js_5fbg_5fsubtraction_2emarkdown_27',['js_bg_subtraction.markdown',['https://docs.opencv.org/4.2.0/d9/d54/js__bg__subtraction_8markdown.html',1,'']]], + ['js_5fcanny_2emarkdown_28',['js_canny.markdown',['https://docs.opencv.org/4.2.0/d5/da5/js__canny_8markdown.html',1,'']]], + ['js_5fcolorspaces_2emarkdown_29',['js_colorspaces.markdown',['https://docs.opencv.org/4.2.0/da/d3b/js__colorspaces_8markdown.html',1,'']]], + ['js_5fcontour_5ffeatures_2emarkdown_30',['js_contour_features.markdown',['https://docs.opencv.org/4.2.0/dc/d73/js__contour__features_8markdown.html',1,'']]], + ['js_5fcontour_5fproperties_2emarkdown_31',['js_contour_properties.markdown',['https://docs.opencv.org/4.2.0/d2/da4/js__contour__properties_8markdown.html',1,'']]], + ['js_5fcontours_5fbegin_2emarkdown_32',['js_contours_begin.markdown',['https://docs.opencv.org/4.2.0/d3/d40/js__contours__begin_8markdown.html',1,'']]], + ['js_5fcontours_5fhierarchy_2emarkdown_33',['js_contours_hierarchy.markdown',['https://docs.opencv.org/4.2.0/db/dc1/js__contours__hierarchy_8markdown.html',1,'']]], + ['js_5fcontours_5fmore_5ffunctions_2emarkdown_34',['js_contours_more_functions.markdown',['https://docs.opencv.org/4.2.0/da/d53/js__contours__more__functions_8markdown.html',1,'']]], + ['js_5fface_5fdetection_2emarkdown_35',['js_face_detection.markdown',['https://docs.opencv.org/4.2.0/dd/d6a/js__face__detection_8markdown.html',1,'']]], + ['js_5fface_5fdetection_5fcamera_2emarkdown_36',['js_face_detection_camera.markdown',['https://docs.opencv.org/4.2.0/d9/dc3/js__face__detection__camera_8markdown.html',1,'']]], + ['js_5ffiltering_2emarkdown_37',['js_filtering.markdown',['https://docs.opencv.org/4.2.0/d8/d93/js__filtering_8markdown.html',1,'']]], + ['js_5ffourier_5ftransform_2emarkdown_38',['js_fourier_transform.markdown',['https://docs.opencv.org/4.2.0/df/d99/js__fourier__transform_8markdown.html',1,'']]], + ['js_5fgeometric_5ftransformations_2emarkdown_39',['js_geometric_transformations.markdown',['https://docs.opencv.org/4.2.0/d3/d3b/js__geometric__transformations_8markdown.html',1,'']]], + ['js_5fgrabcut_2emarkdown_40',['js_grabcut.markdown',['https://docs.opencv.org/4.2.0/d2/ddc/js__grabcut_8markdown.html',1,'']]], + ['js_5fgradients_2emarkdown_41',['js_gradients.markdown',['https://docs.opencv.org/4.2.0/d8/d7c/js__gradients_8markdown.html',1,'']]], + ['js_5fhistogram_5fbackprojection_2emarkdown_42',['js_histogram_backprojection.markdown',['https://docs.opencv.org/4.2.0/da/d92/js__histogram__backprojection_8markdown.html',1,'']]], + ['js_5fhistogram_5fbegins_2emarkdown_43',['js_histogram_begins.markdown',['https://docs.opencv.org/4.2.0/d8/d45/js__histogram__begins_8markdown.html',1,'']]], + ['js_5fhistogram_5fequalization_2emarkdown_44',['js_histogram_equalization.markdown',['https://docs.opencv.org/4.2.0/dc/dbf/js__histogram__equalization_8markdown.html',1,'']]], + ['js_5fhoughcircles_2emarkdown_45',['js_houghcircles.markdown',['https://docs.opencv.org/4.2.0/d1/d4b/js__houghcircles_8markdown.html',1,'']]], + ['js_5fhoughlines_2emarkdown_46',['js_houghlines.markdown',['https://docs.opencv.org/4.2.0/d0/df9/js__houghlines_8markdown.html',1,'']]], + ['js_5fimage_5farithmetics_2emarkdown_47',['js_image_arithmetics.markdown',['https://docs.opencv.org/4.2.0/de/df1/js__image__arithmetics_2js__image__arithmetics_8markdown.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d93/js__some__data__structures_2js__image__arithmetics_8markdown.html',1,'(Global Namespace)']]], + ['js_5fimage_5fdisplay_2emarkdown_48',['js_image_display.markdown',['https://docs.opencv.org/4.2.0/d6/d6a/js__image__display_8markdown.html',1,'']]], + ['js_5fimgproc_5fcamera_2emarkdown_49',['js_imgproc_camera.markdown',['https://docs.opencv.org/4.2.0/d7/db4/js__imgproc__camera_8markdown.html',1,'']]], + ['js_5fintro_2emarkdown_50',['js_intro.markdown',['https://docs.opencv.org/4.2.0/d6/d50/js__intro_8markdown.html',1,'']]], + ['js_5flucas_5fkanade_2emarkdown_51',['js_lucas_kanade.markdown',['https://docs.opencv.org/4.2.0/dd/d67/js__lucas__kanade_8markdown.html',1,'']]], + ['js_5fmeanshift_2emarkdown_52',['js_meanshift.markdown',['https://docs.opencv.org/4.2.0/d8/d53/js__meanshift_8markdown.html',1,'']]], + ['js_5fmorphological_5fops_2emarkdown_53',['js_morphological_ops.markdown',['https://docs.opencv.org/4.2.0/db/dc8/js__morphological__ops_8markdown.html',1,'']]], + ['js_5fnodejs_2emarkdown_54',['js_nodejs.markdown',['https://docs.opencv.org/4.2.0/d9/d61/js__nodejs_8markdown.html',1,'']]], + ['js_5fpyramids_2emarkdown_55',['js_pyramids.markdown',['https://docs.opencv.org/4.2.0/db/dee/js__pyramids_8markdown.html',1,'']]], + ['js_5fsetup_2emarkdown_56',['js_setup.markdown',['https://docs.opencv.org/4.2.0/d1/df5/js__setup_8markdown.html',1,'']]], + ['js_5ftable_5fof_5fcontents_5fcontours_2emarkdown_57',['js_table_of_contents_contours.markdown',['https://docs.opencv.org/4.2.0/d5/dee/js__table__of__contents__contours_8markdown.html',1,'']]], + ['js_5ftable_5fof_5fcontents_5fcore_2emarkdown_58',['js_table_of_contents_core.markdown',['https://docs.opencv.org/4.2.0/d2/dac/js__table__of__contents__core_8markdown.html',1,'']]], + ['js_5ftable_5fof_5fcontents_5fgui_2emarkdown_59',['js_table_of_contents_gui.markdown',['https://docs.opencv.org/4.2.0/d3/dea/js__table__of__contents__gui_8markdown.html',1,'']]], + ['js_5ftable_5fof_5fcontents_5fhistograms_2emarkdown_60',['js_table_of_contents_histograms.markdown',['https://docs.opencv.org/4.2.0/d3/d12/js__table__of__contents__histograms_8markdown.html',1,'']]], + ['js_5ftable_5fof_5fcontents_5fimgproc_2emarkdown_61',['js_table_of_contents_imgproc.markdown',['https://docs.opencv.org/4.2.0/de/d34/js__table__of__contents__imgproc_8markdown.html',1,'']]], + ['js_5ftable_5fof_5fcontents_5fobjdetect_2emarkdown_62',['js_table_of_contents_objdetect.markdown',['https://docs.opencv.org/4.2.0/d5/d35/js__table__of__contents__objdetect_8markdown.html',1,'']]], + ['js_5ftable_5fof_5fcontents_5fsetup_2emarkdown_63',['js_table_of_contents_setup.markdown',['https://docs.opencv.org/4.2.0/d7/d0a/js__table__of__contents__setup_8markdown.html',1,'']]], + ['js_5ftable_5fof_5fcontents_5ftransforms_2emarkdown_64',['js_table_of_contents_transforms.markdown',['https://docs.opencv.org/4.2.0/d9/ddb/js__table__of__contents__transforms_8markdown.html',1,'']]], + ['js_5ftable_5fof_5fcontents_5fvideo_2emarkdown_65',['js_table_of_contents_video.markdown',['https://docs.opencv.org/4.2.0/df/d34/js__table__of__contents__video_8markdown.html',1,'']]], + ['js_5ftemplate_5fmatching_2emarkdown_66',['js_template_matching.markdown',['https://docs.opencv.org/4.2.0/d3/d94/js__template__matching_8markdown.html',1,'']]], + ['js_5fthresholding_2emarkdown_67',['js_thresholding.markdown',['https://docs.opencv.org/4.2.0/d1/dbe/js__thresholding_8markdown.html',1,'']]], + ['js_5ftrackbar_2emarkdown_68',['js_trackbar.markdown',['https://docs.opencv.org/4.2.0/d6/d28/js__trackbar_8markdown.html',1,'']]], + ['js_5ftutorials_2emarkdown_69',['js_tutorials.markdown',['https://docs.opencv.org/4.2.0/dc/d49/js__tutorials_8markdown.html',1,'']]], + ['js_5fusage_2emarkdown_70',['js_usage.markdown',['https://docs.opencv.org/4.2.0/d3/d0f/js__usage_8markdown.html',1,'']]], + ['js_5fvideo_5fdisplay_2emarkdown_71',['js_video_display.markdown',['https://docs.opencv.org/4.2.0/de/d0f/js__video__display_8markdown.html',1,'']]], + ['js_5fwatershed_2emarkdown_72',['js_watershed.markdown',['https://docs.opencv.org/4.2.0/d4/d13/js__watershed_8markdown.html',1,'']]], + ['json_73',['json',['https://nlohmann.github.io/json/doxygen/namespacenlohmann_a2bfd99e845a2e5cd90aeaf1b1431f474.html#a2bfd99e845a2e5cd90aeaf1b1431f474',1,'nlohmann']]], + ['json_5fpointer_74',['json_pointer',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer.html',1,'nlohmann::json_pointer< class >'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa8f1f93b32da01b42413643be32b2c27.html#aa8f1f93b32da01b42413643be32b2c27',1,'nlohmann::basic_json::json_pointer'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a7f32d7c62841f0c4a6784cf741a6e4f8.html#a7f32d7c62841f0c4a6784cf741a6e4f8',1,'nlohmann::json_pointer::json_pointer()']]], + ['json_5fsax_75',['json_sax',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax.html',1,'nlohmann::json_sax< class >'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_aac0f445c1173fa731104d93496a7e780.html#aac0f445c1173fa731104d93496a7e780',1,'nlohmann::json_sax::json_sax()=default'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a8358c063b2d7222b3aafa62fded04403.html#a8358c063b2d7222b3aafa62fded04403',1,'nlohmann::json_sax::json_sax(const json_sax &)=default'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a62dae3713ca4914265904e30cd6b6347.html#a62dae3713ca4914265904e30cd6b6347',1,'nlohmann::json_sax::json_sax(json_sax &&) noexcept=default']]], + ['json_5fsax_5ft_76',['json_sax_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a164b1094a1a9feb54e400d8510bb0b12.html#a164b1094a1a9feb54e400d8510bb0b12',1,'nlohmann::basic_json']]], + ['json_5fserializer_77',['json_serializer',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad6ebc5da7ced975bb184133750e7d49f.html#ad6ebc5da7ced975bb184133750e7d49f',1,'nlohmann::basic_json']]] ]; diff --git a/search/all_14.js b/search/all_14.js index 53e3dc41..eb2ee10b 100644 --- a/search/all_14.js +++ b/search/all_14.js @@ -1,7 +1,7 @@ var searchData= [ - ['k_0',['k',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1datasets_1_1MSM__middleburyObj.html#afe9d8e904da64ce8d5a4f195be40416c',1,'cv::datasets::MSM_middleburyObj::k'],['https://docs.opencv.org/4.2.0/dc/d2c/structcv_1_1detail_1_1ProjectorBase.html#a13770d3c6e1e9b022ad33e72bb714af4',1,'cv::detail::ProjectorBase::k'],['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a420901c23d8196c28d0ad20ca9dbdafa',1,'cv::tracking::UnscentedKalmanFilterParams::k'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#af928f60c8659aada87d333e379afcd1d',1,'std::negative_binomial_distribution::k()']]], - ['k_1',['K',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#aa9171df82e517480b06d135ed1387dc3',1,'cv::detail::CameraParams']]], + ['k_0',['K',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#aa9171df82e517480b06d135ed1387dc3',1,'cv::detail::CameraParams']]], + ['k_1',['k',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1datasets_1_1MSM__middleburyObj.html#afe9d8e904da64ce8d5a4f195be40416c',1,'cv::datasets::MSM_middleburyObj::k'],['https://docs.opencv.org/4.2.0/dc/d2c/structcv_1_1detail_1_1ProjectorBase.html#a13770d3c6e1e9b022ad33e72bb714af4',1,'cv::detail::ProjectorBase::k'],['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a420901c23d8196c28d0ad20ca9dbdafa',1,'cv::tracking::UnscentedKalmanFilterParams::k'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#af928f60c8659aada87d333e379afcd1d',1,'std::negative_binomial_distribution::k()']]], ['k_20means_20clustering_2',['K Means Clustering',['https://docs.opencv.org/4.2.0/d9/d70/tutorial_py_kmeans_index.html',1,'K-Means Clustering'],['https://docs.opencv.org/4.2.0/de/d4d/tutorial_py_kmeans_understanding.html',1,'Understanding K-Means Clustering']]], ['k_20means_20clustering_20in_20opencv_3',['K-Means Clustering in OpenCV',['https://docs.opencv.org/4.2.0/d1/d5c/tutorial_py_kmeans_opencv.html',1,'']]], ['k_20nearest_20neighbour_4',['K-Nearest Neighbour',['https://docs.opencv.org/4.2.0/d0/d72/tutorial_py_knn_index.html',1,'']]], diff --git a/search/all_15.js b/search/all_15.js index 122d9914..40896b54 100644 --- a/search/all_15.js +++ b/search/all_15.js @@ -90,8 +90,8 @@ var searchData= ['launch_87',['launch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5b',1,'std::launch'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5b',1,'launch(Global Namespace)']]], ['launching_20viz_88',['Launching Viz',['https://docs.opencv.org/4.2.0/d5/d7d/tutorial_launching_viz.html',1,'']]], ['launching_5fviz_2emarkdown_89',['launching_viz.markdown',['https://docs.opencv.org/4.2.0/df/da1/launching__viz_8markdown.html',1,'']]], - ['layer_90',['Device layer',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html',1,'']]], - ['layer_91',['Layer',['https://docs.opencv.org/4.2.0/de/d85/group__core__hal.html',1,'Hardware Acceleration Layer'],['https://docs.opencv.org/4.2.0/d3/df3/group__imgproc__hal.html',1,'Hardware Acceleration Layer'],['https://docs.opencv.org/4.2.0/d8/d45/group__feature2d__hal.html',1,'Hardware Acceleration Layer'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html',1,'cv::dnn::Layer'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a32c409ae0f071cb1abd38e34592566e0',1,'cv::dnn::Layer::Layer()'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#af9a80ccb673389ff6664c8b5a94468a5',1,'cv::dnn::Layer::Layer(const LayerParams &params)']]], + ['layer_90',['Layer',['https://docs.opencv.org/4.2.0/de/d85/group__core__hal.html',1,'Hardware Acceleration Layer'],['https://docs.opencv.org/4.2.0/d3/df3/group__imgproc__hal.html',1,'Hardware Acceleration Layer'],['https://docs.opencv.org/4.2.0/d8/d45/group__feature2d__hal.html',1,'Hardware Acceleration Layer'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html',1,'cv::dnn::Layer'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a32c409ae0f071cb1abd38e34592566e0',1,'cv::dnn::Layer::Layer()'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#af9a80ccb673389ff6664c8b5a94468a5',1,'cv::dnn::Layer::Layer(const LayerParams &params)']]], + ['layer_91',['Device layer',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html',1,'']]], ['layer_2edetails_2ehpp_92',['layer.details.hpp',['https://docs.opencv.org/4.2.0/df/d8c/layer_8details_8hpp.html',1,'']]], ['layer_2ehpp_93',['layer.hpp',['https://docs.opencv.org/4.2.0/d4/db0/layer_8hpp.html',1,'']]], ['layerfactory_94',['LayerFactory',['https://docs.opencv.org/4.2.0/d4/d67/classcv_1_1dnn_1_1LayerFactory.html',1,'cv::dnn']]], @@ -124,407 +124,402 @@ var searchData= ['lbphfacerecognizer_121',['LBPHFaceRecognizer',['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html',1,'cv::face']]], ['lc_122',['Lc',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#a02903f3110835213f5656b215576a0b8',1,'cv::cuda::FGDParams']]], ['lcc_123',['Lcc',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#a7578410d39cd5d863176214a8784d0dc',1,'cv::cuda::FGDParams']]], - ['lda_124',['LDA',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html',1,'cv']]], + ['lda_124',['LDA',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html',1,'cv::LDA'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a6d654ebfab272bf734a6ffa35b3ce908',1,'cv::LDA::LDA(int num_components=0)'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a5e8ec64b33aea2317631be0f9b85d833',1,'cv::LDA::LDA(InputArrayOfArrays src, InputArray labels, int num_components=0)']]], ['lda_125',['lda',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a3c05e9ccb53db6cae9254a71d73c87dd',1,'cv::LDA']]], - ['lda_126',['LDA',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a6d654ebfab272bf734a6ffa35b3ce908',1,'cv::LDA::LDA(int num_components=0)'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a5e8ec64b33aea2317631be0f9b85d833',1,'cv::LDA::LDA(InputArrayOfArrays src, InputArray labels, int num_components=0)']]], - ['ldlt_127',['LDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html',1,'Eigen']]], - ['ldlt_128',['ldlt',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ecf058a0727a4cab8b42d79e95072e1',1,'Eigen::MatrixBase::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ecf058a0727a4cab8b42d79e95072e1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ecf058a0727a4cab8b42d79e95072e1',1,'MatrixBase< Solve< Decomposition, RhsType > >::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a644155eef17b37c95d85b9f65bb49ac4',1,'Eigen::SelfAdjointView::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a644155eef17b37c95d85b9f65bb49ac4',1,'SelfAdjointView< const Derived, UpLo >::ldlt()']]], - ['ldlt_129',['LDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a2e06dedd2651649c5b251fbf9ba4e7d4',1,'Eigen::LDLT::LDLT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#ad0e8d2131ea1a626a08d98e9effb1cc5',1,'Eigen::LDLT::LDLT(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#adf853d6cbbc49f3535a44439bca344d9',1,'Eigen::LDLT::LDLT(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a154aa41bd2460199d48861eaf5e4f597',1,'Eigen::LDLT::LDLT(Index size)']]], - ['ldr_5fsize_130',['LDR_SIZE',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gga2a3c172d2347484dc6c32247aef4e90ba11377cb33f0a607d50cdc65e529529a1',1,'cv::LDR_SIZE'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gga2a3c172d2347484dc6c32247aef4e90ba11377cb33f0a607d50cdc65e529529a1',1,'LDR_SIZE(Global Namespace)']]], - ['leakyrelu_131',['LEAKYRELU',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ade71470ec8814021728f8b31b09773b0a193fdf7b38189212e1f7d2584c5ebaf6',1,'cv::ml::ANN_MLP']]], - ['learning_132',['Learning',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html',1,'Machine Learning'],['https://docs.opencv.org/4.2.0/d6/de2/tutorial_py_table_of_contents_ml.html',1,'Machine Learning']]], - ['learning_20based_20white_20balance_20algorithm_133',['Training the learning-based white balance algorithm',['https://docs.opencv.org/4.2.0/dc/dcb/tutorial_xphoto_training_white_balance.html',1,'']]], - ['learning_20layers_20support_134',['Custom deep learning layers support',['https://docs.opencv.org/4.2.0/dc/db1/tutorial_dnn_custom_layers.html',1,'']]], - ['learning_20ml_20module_135',['Machine Learning (ml module)',['https://docs.opencv.org/4.2.0/d1/d69/tutorial_table_of_content_ml.html',1,'']]], - ['learning_20overview_136',['Machine Learning Overview',['https://docs.opencv.org/4.2.0/dc/dd6/ml_intro.html',1,'']]], - ['learning_5frate_137',['learning_rate',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a2cc1c97c643620cf6386a6be2da711de',1,'cv::face::FacemarkKazemi::Params']]], - ['learningbasedwb_138',['LearningBasedWB',['https://docs.opencv.org/4.2.0/d4/d3b/classcv_1_1xphoto_1_1LearningBasedWB.html',1,'cv::xphoto']]], - ['least_20squares_20systems_139',['Solving linear least squares systems',['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'']]], - ['leastsquarediagonalpreconditioner_140',['LeastSquareDiagonalPreconditioner',['https://eigen.tuxfamily.org/dox/classEigen_1_1LeastSquareDiagonalPreconditioner.html',1,'Eigen']]], - ['leastsquaresconjugategradient_141',['LeastSquaresConjugateGradient',['https://eigen.tuxfamily.org/dox/classEigen_1_1LeastSquaresConjugateGradient.html',1,'Eigen::LeastSquaresConjugateGradient< class, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LeastSquaresConjugateGradient.html#ace69f423fcc1f8960d0e2de0667447c9',1,'Eigen::LeastSquaresConjugateGradient::LeastSquaresConjugateGradient()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LeastSquaresConjugateGradient.html#a91c4f2edc20f93cee9b721165937fb99',1,'Eigen::LeastSquaresConjugateGradient::LeastSquaresConjugateGradient(const EigenBase< MatrixDerived > &A)']]], - ['leavebiggestcomponent_142',['leaveBiggestComponent',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#ga855d2fccbcfc3b3477b34d415be5e786',1,'cv::detail::leaveBiggestComponent()'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#ga855d2fccbcfc3b3477b34d415be5e786',1,'leaveBiggestComponent()(Global Namespace)']]], - ['left_143',['left',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#a8a20954e6e4a878fb0a58fc88eb07b89',1,'cv::optflow::GPCTree::Node::left'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#a26231cbf179cf990d4f3a813ffda2e3b',1,'cv::ml::DTrees::Node::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_ios< char, _Traits >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_iostream< char >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_istream< char >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_istream< char, _Traits >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_ostream< char >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_ostream< char, _Traits >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_fstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ifstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ios::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_iostream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_istream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_istringstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ofstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ostream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ostringstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_stringstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::ios_base::left'],['../structkinematics_1_1gearpos__t.html#ab9f24910ece227927746cb148af727f5',1,'kinematics::gearpos_t::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a96d1c2cab30f14f4e34ccb460f1ad1c9',1,'std::left()']]], - ['left_144',['LEFT',['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a69491a271644378beb97b78b33c96c8f',1,'cv::datasets::LEFT'],['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a69491a271644378beb97b78b33c96c8f',1,'LEFT(Global Namespace)']]], - ['left_5fchild_5fnext_5fsibling_5fheap_145',['left_child_next_sibling_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11803.html',1,'__gnu_pbds::detail']]], - ['left_5fchild_5fnext_5fsibling_5fheap_3c_20value_5ftype_2c_20cmp_5ffn_2c_20_5falloc_3a_3asize_5ftype_2c_20_5falloc_20_3e_146',['left_child_next_sibling_heap< Value_Type, Cmp_Fn, _Alloc::size_type, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11803.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_3c_20value_5ftype_2c_20cmp_5ffn_2c_20null_5ftype_2c_20_5falloc_20_3e_147',['left_child_next_sibling_heap< Value_Type, Cmp_Fn, null_type, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11803.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5f_2ehpp_148',['left_child_next_sibling_heap_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01349.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fconst_5fiterator_2ehpp_149',['left_child_next_sibling_heap_/const_iterator.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16655.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_150',['left_child_next_sibling_heap_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16694.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fdebug_5ffn_5fimps_2ehpp_151',['left_child_next_sibling_heap_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16763.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5f_2ferase_5ffn_5fimps_2ehpp_152',['left_child_next_sibling_heap_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16826.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5f_2finfo_5ffn_5fimps_2ehpp_153',['left_child_next_sibling_heap_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16961.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5f_2finsert_5ffn_5fimps_2ehpp_154',['left_child_next_sibling_heap_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16994.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fiterators_5ffn_5fimps_2ehpp_155',['left_child_next_sibling_heap_/iterators_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17045.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fnode_2ehpp_156',['left_child_next_sibling_heap_/node.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17099.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fpoint_5fconst_5fiterator_2ehpp_157',['left_child_next_sibling_heap_/point_const_iterator.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17138.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fpolicy_5faccess_5ffn_5fimps_2ehpp_158',['left_child_next_sibling_heap_/policy_access_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17156.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5f_2ftrace_5ffn_5fimps_2ehpp_159',['left_child_next_sibling_heap_/trace_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17291.html',1,'']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5fconst_5fiterator_5f_160',['left_child_next_sibling_heap_const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#a6d0bc89961b0ee4562057769c0b6d65d',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::left_child_next_sibling_heap_const_iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#ad84cc711e4b85e7e3cd6a56bf0e123fb',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::left_child_next_sibling_heap_const_iterator_(const left_child_next_sibling_heap_const_iterator_< Node, _Alloc > &other)']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5fnode_5f_161',['left_child_next_sibling_heap_node_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11807.html',1,'__gnu_pbds::detail']]], - ['left_5fchild_5fnext_5fsibling_5fheap_5fnode_5fpoint_5fconst_5fiterator_5f_162',['left_child_next_sibling_heap_node_point_const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a2b5ec53c4fd8841483c95d86548cea47',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::left_child_next_sibling_heap_node_point_const_iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a4e9379a36eba962914ad7afe36fd5a98',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::left_child_next_sibling_heap_node_point_const_iterator_(const left_child_next_sibling_heap_node_point_const_iterator_< Node, _Alloc > &other)']]], - ['leftbutton_163',['LeftButton',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#ada240f2528500ad1615e76fb2fd9e2baad19e455b33545d34f237e9f44c8bbd68',1,'cv::viz::MouseEvent']]], - ['legacy_20support_164',['Legacy support',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html',1,'']]], - ['legendre_165',['legendre',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf6eac7fcb98e25b8f3f7d1b95fa7add8',1,'std::legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gafbabf25c3e530e0b94b5e6a3aaab6b5a',1,'std::tr1::legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf6eac7fcb98e25b8f3f7d1b95fa7add8',1,'legendre(unsigned int __l, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gafbabf25c3e530e0b94b5e6a3aaab6b5a',1,'legendre(unsigned int __n, _Tp __x)(Global Namespace)']]], - ['legendref_166',['legendref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaed94e3c664c99f5204da75be75aeac21',1,'std::legendref()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaed94e3c664c99f5204da75be75aeac21',1,'legendref()(Global Namespace)']]], - ['legendrel_167',['legendrel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1b39bc22e3cc4860d08eb54099460391',1,'std::legendrel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1b39bc22e3cc4860d08eb54099460391',1,'legendrel()(Global Namespace)']]], - ['length_168',['length',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#aa226ee4c0ef7a7c622d77247fa82ac6f',1,'cv::tbm::Track::length'],['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a8ec652b7680740bbd0a0109bfb850e52',1,'cv::gapi::fluid::Buffer::length()'],['https://docs.opencv.org/4.2.0/dc/d73/classNCVVector.html#a5baef75e5a70683f42f86669b92da2a0',1,'NCVVector::length()'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#affc98774183eb6e5874f971d19f21961',1,'cv::gapi::fluid::View::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9409606a0963903c52cc2cb72f21fb27',1,'__gnu_cxx::__versa_string::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'__gnu_debug::basic_string::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< _CharT >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< _CharT, _Traits, _Allocator >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< char >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< char, char_traits< char >, _Byte_alloc >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< char_type, _Traits, _Alloc >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< value_type >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4d5afaf65af6a5038ad666a6b4ac3836',1,'match_results< _Bi_iter >::length(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4d5afaf65af6a5038ad666a6b4ac3836',1,'match_results< _Bi_iter >::length(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a2d1679803ff038b130a3ac2d545da164',1,'regex_traits< _CharType >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'std::basic_string::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4d5afaf65af6a5038ad666a6b4ac3836',1,'std::match_results::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a2d1679803ff038b130a3ac2d545da164',1,'std::regex_traits::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#a553c0f19fbcb8bb670b0f26799a053ea',1,'std::sub_match::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#a553c0f19fbcb8bb670b0f26799a053ea',1,'sub_match< _Bi_iter >::length()']]], - ['length_20encoded_20image_169',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], - ['length_5ferror_170',['length_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02803.html',1,'std']]], - ['less_171',['less',['https://docs.opencv.org/4.2.0/d0/d04/structcv_1_1cudev_1_1less.html',1,'cv::cudev::less< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07415.html',1,'std::less< _Tp >']]], - ['less_3c_20void_20_3e_172',['less< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07471.html',1,'std']]], - ['less_5fequal_173',['less_equal',['https://docs.opencv.org/4.2.0/d1/d03/structcv_1_1cudev_1_1less__equal.html',1,'cv::cudev::less_equal< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07423.html',1,'std::less_equal< class >']]], - ['less_5fequal_3c_20void_20_3e_174',['less_equal< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07511.html',1,'std']]], - ['level_175',['level',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#aa7e9fa13d1173ba688b3550f959be364',1,'cv::text::ERStat::level'],['https://docs.opencv.org/4.2.0/d3/d18/structcv_1_1utils_1_1logging_1_1LogTag.html#ab2f82b2f9e4ed222078e35dfc3bfebe4',1,'cv::utils::logging::LogTag::level']]], - ['level_20api_20for_20external_20libraries_20plugins_176',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], - ['level_20design_20overview_177',['High-level design overview',['https://docs.opencv.org/4.2.0/de/d4d/gapi_hld.html',1,'']]], - ['level_20format_178',['Top-Level Format',['../cameraconfig.html#toplevel',1,'']]], - ['level_20gui_179',['High-level GUI',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html',1,'']]], - ['level_20gui_20and_20media_20highgui_20module_180',['High Level GUI and Media (highgui module)',['https://docs.opencv.org/4.2.0/d0/de2/tutorial_table_of_content_highgui.html',1,'']]], - ['level_20stitching_20api_20stitcher_20class_181',['High level stitching API (Stitcher class)',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'']]], - ['lex_182',['lex',['https://docs.opencv.org/4.2.0/d3/dc5/structcv_1_1datasets_1_1TR__svtObj.html#acbdbda9e155a7b67d77f715f786b5bb0',1,'cv::datasets::TR_svtObj']]], - ['lex100_183',['lex100',['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1datasets_1_1TR__icdarObj.html#afe4ea0f002c92e2552158ac5fa15b7ac',1,'cv::datasets::TR_icdarObj']]], - ['lexfull_184',['lexFull',['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1datasets_1_1TR__icdarObj.html#a4900b546a13391639c33024d437f2bd0',1,'cv::datasets::TR_icdarObj']]], - ['lexicographical_5fcompare_185',['lexicographical_compare',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga869d1fd6bb4929ef491edbfdbcc9f7b9',1,'std::lexicographical_compare(_II1 __first1, _II1 __last1, _II2 __first2, _II2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gae179ce2d015dc0908973644687dce4c6',1,'std::lexicographical_compare(_II1 __first1, _II1 __last1, _II2 __first2, _II2 __last2, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga869d1fd6bb4929ef491edbfdbcc9f7b9',1,'lexicographical_compare(_II1 __first1, _II1 __last1, _II2 __first2, _II2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gae179ce2d015dc0908973644687dce4c6',1,'lexicographical_compare(_II1 __first1, _II1 __last1, _II2 __first2, _II2 __last2, _Compare __comp)(Global Namespace)']]], - ['lexicographical_5fcompare_5f3way_186',['lexicographical_compare_3way',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gadd7eb026c10d4a6929b8c61d0501bdee',1,'__gnu_cxx::lexicographical_compare_3way()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gadd7eb026c10d4a6929b8c61d0501bdee',1,'lexicographical_compare_3way(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)(Global Namespace)']]], - ['lfts_5fconfig_2eh_187',['lfts_config.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01001.html',1,'']]], - ['lgamma_188',['lgamma',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ac2e6331628bb1989b7be6d7e42827649',1,'Eigen']]], - ['lhs_189',['lhs',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseBinaryOp.html#a33b8ee8eda1d963591b80ec07525f918',1,'Eigen::CwiseBinaryOp']]], - ['libmv_5fcameraintrinsicsoptions_190',['libmv_CameraIntrinsicsOptions',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html',1,'cv::sfm::libmv_CameraIntrinsicsOptions'],['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#afdc199c0b44e2ad43f581277020494b7',1,'cv::sfm::libmv_CameraIntrinsicsOptions::libmv_CameraIntrinsicsOptions()']]], - ['libmv_5freconstructionoptions_191',['libmv_ReconstructionOptions',['https://docs.opencv.org/4.2.0/d1/d61/classcv_1_1sfm_1_1libmv__ReconstructionOptions.html',1,'cv::sfm::libmv_ReconstructionOptions'],['https://docs.opencv.org/4.2.0/d1/d61/classcv_1_1sfm_1_1libmv__ReconstructionOptions.html#a4a4d4ad0f4413f7947982699f2a1a78b',1,'cv::sfm::libmv_ReconstructionOptions::libmv_ReconstructionOptions()']]], - ['libraries_20plugins_192',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], - ['light_193',['light',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ggaa38573e5a0fc4bf3706c054bf78abe32ad270947696ed1ad9ec4e9dd2ace1a024',1,'cv::datasets::light'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ggaa38573e5a0fc4bf3706c054bf78abe32ad270947696ed1ad9ec4e9dd2ace1a024',1,'light(Global Namespace)']]], - ['light_20api_194',['Structured Light API',['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html',1,'']]], - ['light_20tutorials_195',['Structured Light tutorials',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_structured_light.html',1,'']]], - ['lighting_196',['LIGHTING',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca1cf60cd6e7bb2919685ba047588085f3',1,'cv::viz::LIGHTING'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca1cf60cd6e7bb2919685ba047588085f3',1,'LIGHTING(Global Namespace)']]], - ['lightpose_197',['lightPose',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a1f03bce2a2f7acd1de7c9a886ca95570',1,'cv::dynafu::Params::lightPose'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a0b1c583ce09e20fbbcd138300ab4b05d',1,'cv::kinfu::Params::lightPose']]], - ['lime_198',['lime',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a990019705b2219eaa478612846714622',1,'cv::viz::Color']]], - ['limit_5fadjustor_199',['limit_adjustor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10703.html',1,'__gnu_cxx::limit_condition']]], - ['limit_5fcondition_200',['limit_condition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10687.html',1,'__gnu_cxx']]], - ['limits_201',['limits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00095.html',1,'']]], - ['limits_2ehpp_202',['limits.hpp',['https://docs.opencv.org/4.2.0/d7/d42/modules_2core_2include_2opencv2_2core_2cuda_2limits_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d46/contrib_2modules_2cudev_2include_2opencv2_2cudev_2util_2limits_8hpp.html',1,'(Global Namespace)']]], - ['limitswitchdata_203',['LimitSwitchData',['../classrobot_1_1types_1_1LimitSwitchData.html',1,'robot::types::LimitSwitchData'],['../classrobot_1_1types_1_1LimitSwitchData.html#a1fd3d2cee4b3b5ea416d651b9255ba24',1,'robot::types::LimitSwitchData::LimitSwitchData()']]], - ['limitswitchhigh_204',['limitSwitchHigh',['../structrobot_1_1encparams__t.html#a0c643c14682b7da130b53098e1902bab',1,'robot::encparams_t']]], - ['limitswitchlow_205',['limitSwitchLow',['../structrobot_1_1encparams__t.html#ae86fcd25014e6c1738d55e85a0989cbd',1,'robot::encparams_t']]], - ['line_206',['Line',['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html',1,'cv::gapi::wip::draw']]], - ['line_207',['line',['https://docs.opencv.org/4.2.0/d4/dd9/structcvv_1_1impl_1_1CallMetaData.html#a3d28262421ad0e7426f63f7b6ab2c893',1,'cvv::impl::CallMetaData::line'],['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#aa81481ded6391d046768d9829c56fd90',1,'cv::Exception::line']]], - ['line_208',['Line',['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#aba7af35a1455413aca6c5e1556de6ae7',1,'cv::gapi::wip::draw::Line']]], - ['line_209',['line',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga7078a9fae8c7e7d13d24dac2520ae4a2',1,'cv::line()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga7078a9fae8c7e7d13d24dac2520ae4a2',1,'line(InputOutputArray img, Point pt1, Point pt2, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)']]], - ['line_20detector_210',['Fast line detector',['https://docs.opencv.org/4.2.0/df/ded/group__ximgproc__fast__line__detector.html',1,'']]], - ['line_20features_20tutorial_211',['Line Features Tutorial',['https://docs.opencv.org/4.2.0/df/dfa/tutorial_line_descriptor_main.html',1,'']]], - ['line_20transform_212',['Line Transform',['https://docs.opencv.org/4.2.0/d9/db0/tutorial_hough_lines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d6/d10/tutorial_py_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d3/de6/tutorial_js_houghlines.html',1,'Hough Line Transform']]], - ['line_5f4_213',['LINE_4',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a784ee59ec27d8bc88acddfb89c22f185',1,'cv::LINE_4'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a784ee59ec27d8bc88acddfb89c22f185',1,'LINE_4(Global Namespace)']]], - ['line_5f8_214',['LINE_8',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a5d32eda7017db273a37f158e5b51442a',1,'cv::LINE_8'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a5d32eda7017db273a37f158e5b51442a',1,'LINE_8(Global Namespace)']]], - ['line_5faa_215',['LINE_AA',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a85fdabe5335c9e6656563dfd7c94fb4f',1,'cv::LINE_AA'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a85fdabe5335c9e6656563dfd7c94fb4f',1,'LINE_AA(Global Namespace)']]], - ['line_5fdescriptor_2ehpp_216',['line_descriptor.hpp',['https://docs.opencv.org/4.2.0/df/d4a/line__descriptor_8hpp.html',1,'']]], - ['line_5floop_217',['LINE_LOOP',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabaf4d36edb6cf9011af8cf4015b5a61952',1,'cv::ogl::LINE_LOOP'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabaf4d36edb6cf9011af8cf4015b5a61952',1,'LINE_LOOP(Global Namespace)']]], - ['line_5fstrip_218',['LINE_STRIP',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba7aa95cc95670cd6bb875d0092e3bf457',1,'cv::ogl::LINE_STRIP'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba7aa95cc95670cd6bb875d0092e3bf457',1,'LINE_STRIP(Global Namespace)']]], - ['line_5ftype_219',['line_type',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a128c7f4c9bb3a29aabace35d44ad4004',1,'cv::QtFont']]], - ['line_5fwidth_220',['LINE_WIDTH',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca06fc87e04c15fbfad2977314751a8738',1,'cv::viz::LINE_WIDTH'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca06fc87e04c15fbfad2977314751a8738',1,'LINE_WIDTH(Global Namespace)']]], - ['linear_221',['linear',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#aba3b127ac7c7bd3d99d533a59f22242a',1,'cv::Affine3::linear(const Mat3 &L)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a914f41895b8a246232db4a186b70d480',1,'cv::Affine3::linear() const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#aba3b127ac7c7bd3d99d533a59f22242a',1,'Affine3< float >::linear(const Mat3 &L)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a914f41895b8a246232db4a186b70d480',1,'Affine3< float >::linear() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ad36538ee2c2970722eff343ee1bbfc7c',1,'Eigen::Transform::linear()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#af8c38249632146453785add778dc1081',1,'Eigen::Transform::linear() const']]], - ['linear_222',['LINEAR',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56ab92a19ab0c193735c3fd71f938dd87e7',1,'cv::ml::SVM::LINEAR'],['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#ggaf0af0db4c870be3ef86132870821d452a4d3d0c977941e929e23e9c6cb4ae4715',1,'cv::ft::LINEAR'],['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#ggaf0af0db4c870be3ef86132870821d452a4d3d0c977941e929e23e9c6cb4ae4715',1,'LINEAR(Global Namespace)']]], - ['linear_20algebra_223',['Sparse linear algebra',['https://eigen.tuxfamily.org/dox/group__Sparse__chapter.html',1,'']]], - ['linear_20algebra_20and_20decompositions_224',['Linear algebra and decompositions',['https://eigen.tuxfamily.org/dox/group__TutorialLinearAlgebra.html',1,'']]], - ['linear_20filters_225',['Making your own linear filters!',['https://docs.opencv.org/4.2.0/d4/dbd/tutorial_filter_2d.html',1,'']]], - ['linear_20least_20squares_20systems_226',['Solving linear least squares systems',['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'']]], - ['linear_20problems_20and_20decompositions_227',['Dense linear problems and decompositions',['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'']]], - ['linear_20systems_228',['Solving Sparse Linear Systems',['https://eigen.tuxfamily.org/dox/group__TopicSparseSystems.html',1,'']]], - ['linear_5fcongruential_5fengine_229',['linear_congruential_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html',1,'std::linear_congruential_engine< _UIntType, __a, __c, __m >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a8444b5d92cc748637faad0a99a74b465',1,'std::linear_congruential_engine::linear_congruential_engine()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a369efa188a734025bb65bf6fcec77cf3',1,'std::linear_congruential_engine::linear_congruential_engine(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a3e49cb7b04e60dfae94dd28844521da4',1,'std::linear_congruential_engine::linear_congruential_engine(_Sseq &__q)']]], - ['linear_5findex_2eh_230',['linear_index.h',['https://docs.opencv.org/4.2.0/dd/d0d/linear__index_8h.html',1,'']]], - ['linear_5fprobe_5ffn_231',['linear_probe_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11143.html',1,'__gnu_pbds']]], - ['linear_5fprobe_5ffn_5fimp_2ehpp_232',['linear_probe_fn_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01316.html',1,'']]], - ['linearaccessbit_233',['LinearAccessBit',['https://eigen.tuxfamily.org/dox/group__flags.html#ga4b983a15d57cd55806df618ac544d09e',1,'Eigen::LinearAccessBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#ga4b983a15d57cd55806df618ac544d09e',1,'LinearAccessBit(Global Namespace)']]], - ['linearinterptr_234',['LinearInterPtr',['https://docs.opencv.org/4.2.0/d7/d8a/structcv_1_1cudev_1_1LinearInterPtr.html',1,'cv::cudev']]], - ['linearinterptrsz_235',['LinearInterPtrSz',['https://docs.opencv.org/4.2.0/d9/d2e/structcv_1_1cudev_1_1LinearInterPtrSz.html',1,'cv::cudev']]], - ['linearly_20separable_20data_236',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], - ['linearmatrixtype_237',['LinearMatrixType',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a48138c0370e55371b95946c90d69e25c',1,'Eigen::Transform::LinearMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#ac5aca3bc67564e96ad550aba971de8b6',1,'Eigen::Translation::LinearMatrixType']]], - ['linearmemories_238',['LinearMemories',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#adb0b556a1308ff2bb81ad81e74e06a65',1,'cv::linemod::Detector']]], - ['linearmemorypyramid_239',['LinearMemoryPyramid',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a4063f79d0d03ee9652ca92abfe0cb950',1,'cv::linemod::Detector']]], - ['linearpart_240',['LinearPart',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a2195bd42561e691a8f6e7d989e77f328',1,'Eigen::Transform']]], - ['linearpolar_241',['linearPolar',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gaa38a6884ac8b6e0b9bed47939b5362f3',1,'cv::linearPolar()'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gaa38a6884ac8b6e0b9bed47939b5362f3',1,'linearPolar()(Global Namespace)']]], - ['lineiterator_242',['LineIterator',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html',1,'cv::LineIterator'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#ac83a4c574ce6a50a78a52d7eee10371b',1,'cv::LineIterator::LineIterator()']]], - ['linelength_243',['lineLength',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a7a1b7b2712a9c77d64d749729bdb79c2',1,'cv::line_descriptor::KeyLine']]], - ['linemod_2ehpp_244',['linemod.hpp',['https://docs.opencv.org/4.2.0/d7/d7a/linemod_8hpp.html',1,'']]], - ['lineptr_245',['linePtr',['https://docs.opencv.org/4.2.0/da/da5/structcv_1_1gapi_1_1fluid_1_1View_1_1Cache.html#aece02a10ae9f35a53dc89e57db2ab595',1,'cv::gapi::fluid::View::Cache']]], - ['lines_246',['LINES',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8ea1de81114c3db43c9dfa96870367a0',1,'cv::ogl::LINES'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8ea1de81114c3db43c9dfa96870367a0',1,'LINES(Global Namespace)']]], - ['lines_20by_20using_20morphological_20operations_247',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], - ['lines_20extracted_20from_20an_20image_248',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], - ['linesegmentdetector_249',['LineSegmentDetector',['https://docs.opencv.org/4.2.0/db/d73/classcv_1_1LineSegmentDetector.html',1,'cv']]], - ['linesegmentdetectormodes_250',['LineSegmentDetectorModes',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gad092a7362b8afb8a905238a41898d98c',1,'cv::LineSegmentDetectorModes'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gad092a7362b8afb8a905238a41898d98c',1,'LineSegmentDetectorModes(Global Namespace)']]], - ['linesready_251',['linesReady',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a502e0fa925af5cb42da841bc602ec942',1,'cv::gapi::fluid::Buffer']]], - ['linetypes_252',['LineTypes',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaf076ef45de481ac96e0ab3dc2c29a777',1,'cv::LineTypes'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaf076ef45de481ac96e0ab3dc2c29a777',1,'LineTypes(Global Namespace)']]], - ['linkeravailable_253',['linkerAvailable',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2a05649820a826afdb7d627f1b9cf408',1,'cv::ocl::Device']]], - ['linspaced_254',['LinSpaced',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ad8098aa5971139a5585e623dddbea860',1,'Eigen::DenseBase::LinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aaef589c1dbd7fad93f97bd3fa1b1e768',1,'Eigen::DenseBase::LinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2585c4a3458485a30a97afed81d85a92',1,'Eigen::DenseBase::LinSpaced(Sequential_t, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae08ebe5f98339ce1410fef9ba34e5918',1,'Eigen::DenseBase::LinSpaced(Sequential_t, Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ad8098aa5971139a5585e623dddbea860',1,'DenseBase< ArrayWrapper< ExpressionType > >::LinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aaef589c1dbd7fad93f97bd3fa1b1e768',1,'DenseBase< ArrayWrapper< ExpressionType > >::LinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2585c4a3458485a30a97afed81d85a92',1,'DenseBase< ArrayWrapper< ExpressionType > >::LinSpaced(Sequential_t, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae08ebe5f98339ce1410fef9ba34e5918',1,'DenseBase< ArrayWrapper< ExpressionType > >::LinSpaced(Sequential_t, Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ad8098aa5971139a5585e623dddbea860',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::LinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aaef589c1dbd7fad93f97bd3fa1b1e768',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::LinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2585c4a3458485a30a97afed81d85a92',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::LinSpaced(Sequential_t, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae08ebe5f98339ce1410fef9ba34e5918',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::LinSpaced(Sequential_t, Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ad8098aa5971139a5585e623dddbea860',1,'DenseBase< Solve< Decomposition, RhsType > >::LinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aaef589c1dbd7fad93f97bd3fa1b1e768',1,'DenseBase< Solve< Decomposition, RhsType > >::LinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2585c4a3458485a30a97afed81d85a92',1,'DenseBase< Solve< Decomposition, RhsType > >::LinSpaced(Sequential_t, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae08ebe5f98339ce1410fef9ba34e5918',1,'DenseBase< Solve< Decomposition, RhsType > >::LinSpaced(Sequential_t, Index size, const Scalar &low, const Scalar &high)']]], - ['linux_255',['Installation in Linux',['https://docs.opencv.org/4.2.0/d7/d9f/tutorial_linux_install.html',1,'']]], - ['linux_20systems_256',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]], - ['linux_5feclipse_2emarkdown_257',['linux_eclipse.markdown',['https://docs.opencv.org/4.2.0/da/d37/linux__eclipse_8markdown.html',1,'']]], - ['linux_5fgcc_5fcmake_2emarkdown_258',['linux_gcc_cmake.markdown',['https://docs.opencv.org/4.2.0/df/dc3/linux__gcc__cmake_8markdown.html',1,'']]], - ['linux_5finstall_2emarkdown_259',['linux_install.markdown',['https://docs.opencv.org/4.2.0/d7/d12/linux__install_8markdown.html',1,'']]], - ['list_260',['list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08863.html',1,'std::__debug::list< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09119.html',1,'std::__profile::list< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html',1,'std::list< _Tp, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00098.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8bd45a3517b01002de6debdb401d9170',1,'list< __inp, __rebind_inp >::list()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b6d1424066dbfd18daebac90d143837',1,'list< __inp, __rebind_inp >::list(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3f6568813bbdefbd94cbde64e3e45366',1,'list< __inp, __rebind_inp >::list(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac739777416320440d35c6de1a42ba818',1,'list< __inp, __rebind_inp >::list(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aec4657b924fb0c29b7d3e347a2da97f0',1,'list< __inp, __rebind_inp >::list(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a138af8bc9ad16e2d9f1f51057b50a786',1,'list< __inp, __rebind_inp >::list(list &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#abc914a91c0740ca3f52168d0b631dbf8',1,'list< __inp, __rebind_inp >::list(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad905b1f7f844c8715c654439611804a1',1,'list< __inp, __rebind_inp >::list(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8bd45a3517b01002de6debdb401d9170',1,'std::list::list()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b6d1424066dbfd18daebac90d143837',1,'std::list::list(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3f6568813bbdefbd94cbde64e3e45366',1,'std::list::list(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac739777416320440d35c6de1a42ba818',1,'std::list::list(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aec4657b924fb0c29b7d3e347a2da97f0',1,'std::list::list(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a138af8bc9ad16e2d9f1f51057b50a786',1,'std::list::list(list &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#abc914a91c0740ca3f52168d0b631dbf8',1,'std::list::list(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad905b1f7f844c8715c654439611804a1',1,'std::list::list(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())']]], - ['list_20based_261',['List-Based',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01532.html',1,'']]], - ['list_20of_20implemented_20layers_262',['Partial List of Implemented Layers',['https://docs.opencv.org/4.2.0/d6/d87/group__dnnLayerList.html',1,'']]], - ['list_2etcc_263',['list.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00392.html',1,'']]], - ['list_3c_20_5f_5finp_2c_20_5f_5frebind_5finp_20_3e_264',['list< __inp, __rebind_inp >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html',1,'']]], - ['list_3c_20t_20_3e_265',['list< T >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html',1,'std']]], - ['list_5fpartition_266',['list_partition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ad3be0fcbf87a1f43b3ecd406841e7b0d',1,'__gnu_parallel']]], - ['list_5fpartition_2eh_267',['list_partition.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00911.html',1,'']]], - ['list_5fupdate_268',['list_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11123.html',1,'__gnu_pbds::list_update< class, class, class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11123.html#a9d7daaa0c1b890842f1117e4be17366d',1,'__gnu_pbds::list_update::list_update()']]], - ['list_5fupdate_5fmap_5f_2fconstructor_5fdestructor_5ffn_5fimps_2ehpp_269',['list_update_map_/constructor_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16667.html',1,'']]], - ['list_5fupdate_5fmap_5f_2fdebug_5ffn_5fimps_2ehpp_270',['list_update_map_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16766.html',1,'']]], - ['list_5fupdate_5fmap_5f_2ferase_5ffn_5fimps_2ehpp_271',['list_update_map_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16829.html',1,'']]], - ['list_5fupdate_5fmap_5f_2ffind_5ffn_5fimps_2ehpp_272',['list_update_map_/find_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16880.html',1,'']]], - ['list_5fupdate_5fmap_5f_2finfo_5ffn_5fimps_2ehpp_273',['list_update_map_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16964.html',1,'']]], - ['list_5fupdate_5fmap_5f_2finsert_5ffn_5fimps_2ehpp_274',['list_update_map_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16997.html',1,'']]], - ['list_5fupdate_5fmap_5f_2fiterators_5ffn_5fimps_2ehpp_275',['list_update_map_/iterators_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17048.html',1,'']]], - ['list_5fupdate_5fmap_5f_2ftrace_5ffn_5fimps_2ehpp_276',['list_update_map_/trace_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17294.html',1,'']]], - ['list_5fupdate_5fpolicy_2ehpp_277',['list_update_policy.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01124.html',1,'']]], - ['list_5fupdate_5ftag_278',['list_update_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11263.html',1,'__gnu_pbds']]], - ['lkpyrlvl_279',['lkPyrLvl',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga59b5126cf58c191527c64234a54b876b',1,'cv::stereo::PropagationParameters::lkPyrLvl'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga59b5126cf58c191527c64234a54b876b',1,'lkPyrLvl(Global Namespace)']]], - ['lktemplatesize_280',['lkTemplateSize',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga894232404cc4ce4b8bac3bb0f3893362',1,'cv::stereo::PropagationParameters::lkTemplateSize'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga894232404cc4ce4b8bac3bb0f3893362',1,'lkTemplateSize(Global Namespace)']]], - ['lktermparam1_281',['lkTermParam1',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga0d3863109d84b3699a19da1fac633029',1,'cv::stereo::PropagationParameters::lkTermParam1'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga0d3863109d84b3699a19da1fac633029',1,'lkTermParam1(Global Namespace)']]], - ['lktermparam2_282',['lkTermParam2',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga5e19e65ee5209dda3ad2bb342a3fc5a2',1,'cv::stereo::PropagationParameters::lkTermParam2'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga5e19e65ee5209dda3ad2bb342a3fc5a2',1,'lkTermParam2(Global Namespace)']]], - ['llapi_2eh_283',['llapi.h',['https://docs.opencv.org/4.2.0/dd/df3/llapi_8h.html',1,'']]], - ['llt_284',['LLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html',1,'Eigen']]], - ['llt_285',['llt',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90c45f7a30265df792d5aeaddead2635',1,'Eigen::MatrixBase::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90c45f7a30265df792d5aeaddead2635',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90c45f7a30265df792d5aeaddead2635',1,'MatrixBase< Solve< Decomposition, RhsType > >::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a405e810491642a7f7b785f2ad6f93619',1,'Eigen::SelfAdjointView::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a405e810491642a7f7b785f2ad6f93619',1,'SelfAdjointView< const Derived, UpLo >::llt()']]], - ['llt_286',['LLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a16d1ec9ea6497ba1febb242c2e8a7a96',1,'Eigen::LLT::LLT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a1848a00addade9a0f7f70493c52ecc9d',1,'Eigen::LLT::LLT(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#ab3656cfbdf38e03c57d5cf79bf8131b6',1,'Eigen::LLT::LLT(Index size)']]], - ['lmeds_287',['LMEDS',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggaaedb1f94e6b143cef163622c531afd88ae59a3f6677ddd05b96a298a6c24fcbe6',1,'cv::LMEDS'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggaaedb1f94e6b143cef163622c531afd88ae59a3f6677ddd05b96a298a6c24fcbe6',1,'LMEDS(Global Namespace)']]], - ['lmsolver_288',['LMSolver',['https://docs.opencv.org/4.2.0/d3/d6d/classcv_1_1LMSolver.html',1,'cv']]], - ['load_289',['load',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a623841c33b58ea9c4847da04607e067b',1,'cv::Algorithm::load()'],['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ac24cc2e2fc5cd1dd74fd5da31886fbb7',1,'cv::ml::ANN_MLP::load()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1datasets_1_1AR__hmdb.html#ac90c6e2af727fc53b7b0c65de75d75c9',1,'cv::datasets::AR_hmdb::load()'],['https://docs.opencv.org/4.2.0/d5/d36/classcv_1_1datasets_1_1AR__sports.html#a9e166c859594903c69aa455e6542276c',1,'cv::datasets::AR_sports::load()'],['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#a2d27bbc1d1d4fa7326848f9fae7999d7',1,'cv::BaseCascadeClassifier::load()'],['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a3ff5b7d19b3d715501b3ce4e1f0563e1',1,'cv::ml::Boost::load()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a1a5884c8cc749422f9eb77c2471958bc',1,'cv::CascadeClassifier::load()'],['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html#a69d6b25f752721f9c4f6d6a1bf66aa5d',1,'cv::datasets::Dataset::load()'],['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a9a13c065058afce14367ca44739fb4df',1,'cv::ml::DTrees::load()'],['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a90eec814e087b4d8c3ff9e92f8069f6a',1,'cv::ml::EM::load()'],['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#ae47c184a8b4234f20812abf9e7fb35f4',1,'cv::cudacodec::EncoderParams::load()'],['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1datasets_1_1FR__adience.html#a07d1b4cc4c889723ddce8871a3e163e0',1,'cv::datasets::FR_adience::load()'],['https://docs.opencv.org/4.2.0/dd/dda/classcv_1_1datasets_1_1FR__lfw.html#ab27b85e70528aeeac6d2df24de29b538',1,'cv::datasets::FR_lfw::load()'],['https://docs.opencv.org/4.2.0/d9/d14/classcv_1_1datasets_1_1GR__chalearn.html#a64506d54f0bb14d3ce08d1950ecd4fbd',1,'cv::datasets::GR_chalearn::load()'],['https://docs.opencv.org/4.2.0/d0/deb/classcv_1_1datasets_1_1GR__skig.html#a281a8a0041423d7bd251610cb40875e0',1,'cv::datasets::GR_skig::load()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a957f55d36ba2f1a2ae47883c11f4b730',1,'cv::HOGDescriptor::load()'],['https://docs.opencv.org/4.2.0/d5/d42/classcv_1_1datasets_1_1HPE__humaneva.html#a269d8987797bffb9493782a8a40ed7f5',1,'cv::datasets::HPE_humaneva::load()'],['https://docs.opencv.org/4.2.0/d6/d72/classcv_1_1datasets_1_1HPE__parse.html#a0a0b7e768f05ebc8aa5161e8c56cf514',1,'cv::datasets::HPE_parse::load()'],['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1datasets_1_1IR__affine.html#ab42ab085a182539bd9d828cbeb63328f',1,'cv::datasets::IR_affine::load()'],['https://docs.opencv.org/4.2.0/d7/d5f/classcv_1_1datasets_1_1IR__robot.html#ab2ca17a360201029a1967af34dcc283e',1,'cv::datasets::IR_robot::load()'],['https://docs.opencv.org/4.2.0/dd/d0e/classcv_1_1datasets_1_1IS__bsds.html#a77835f3c33526b756a4f6c1ef3783333',1,'cv::datasets::IS_bsds::load()'],['https://docs.opencv.org/4.2.0/d9/dbe/classcv_1_1datasets_1_1IS__weizmann.html#a11aabfdc1bcea1d9f7311f2990fce38b',1,'cv::datasets::IS_weizmann::load()'],['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#a99bf8ce6bba7fcfdd791c6e5eedae8ac',1,'cv::ml::KNearest::load()'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#ab5a8bf45f2ad6aee3b8b02a816cb1282',1,'cv::LDA::load(const String &filename)'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#ace12ed0301bbd01b8fc16934c9a4c580',1,'cv::LDA::load(const FileStorage &node)'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#af3a20a4bc0f92ca2c5c1a2e46713b2f0',1,'cv::ml::LogisticRegression::load()'],['https://docs.opencv.org/4.2.0/d9/d5c/classcv_1_1face_1_1MACE.html#aeb77d3c0143b44269c556cff10f4e4a0',1,'cv::face::MACE::load()'],['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a54407fef69977bb6344f0ec2e3678083',1,'cv::viz::Mesh::load()'],['https://docs.opencv.org/4.2.0/dc/de4/classcv_1_1datasets_1_1MSM__epfl.html#a5cea4fa9eae9bce324887310a3a31111',1,'cv::datasets::MSM_epfl::load()'],['https://docs.opencv.org/4.2.0/d2/dcc/classcv_1_1datasets_1_1MSM__middlebury.html#ae96c249cffcb6675ea6e120bcef24910',1,'cv::datasets::MSM_middlebury::load()'],['https://docs.opencv.org/4.2.0/d4/d8e/classcv_1_1ml_1_1NormalBayesClassifier.html#a147a2579967d89637f0434c261bfb1e0',1,'cv::ml::NormalBayesClassifier::load()'],['https://docs.opencv.org/4.2.0/db/df7/classcv_1_1datasets_1_1OR__imagenet.html#a5f1402f12579dbb8092ef6b5759ec455',1,'cv::datasets::OR_imagenet::load()'],['https://docs.opencv.org/4.2.0/d9/d92/classcv_1_1datasets_1_1OR__mnist.html#a471654dbc84df363ec29ca71ef68438c',1,'cv::datasets::OR_mnist::load()'],['https://docs.opencv.org/4.2.0/d4/d7e/classcv_1_1datasets_1_1OR__pascal.html#a2e4eb062497587b89f72e7495f0dfd05',1,'cv::datasets::OR_pascal::load()'],['https://docs.opencv.org/4.2.0/da/d69/classcv_1_1datasets_1_1OR__sun.html#a8cb3d99b80669c7d56c489916c541d3b',1,'cv::datasets::OR_sun::load()'],['https://docs.opencv.org/4.2.0/da/d8d/classcv_1_1datasets_1_1PD__caltech.html#ae5790097375df75df4e18f7dedfa366a',1,'cv::datasets::PD_caltech::load()'],['https://docs.opencv.org/4.2.0/d2/d61/classcv_1_1datasets_1_1PD__inria.html#afaec78fa88b3f0ad00bc9372615cb5e2',1,'cv::datasets::PD_inria::load()'],['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html#adada11573469e5df2e05da93e8239704',1,'cv::ml::RTrees::load()'],['https://docs.opencv.org/4.2.0/d6/d92/classcv_1_1datasets_1_1SLAM__kitti.html#a5df4388ba40eec6329d0b51bb9391279',1,'cv::datasets::SLAM_kitti::load()'],['https://docs.opencv.org/4.2.0/da/d91/classcv_1_1datasets_1_1SLAM__tumindoor.html#a508c646200a6f0b0a22a9d1dc69f2422',1,'cv::datasets::SLAM_tumindoor::load()'],['https://docs.opencv.org/4.2.0/d6/d05/classcv_1_1datasets_1_1SR__bsds.html#a193438fcd7b9f8b021e24bcc9cf53588',1,'cv::datasets::SR_bsds::load()'],['https://docs.opencv.org/4.2.0/d2/db5/classcv_1_1datasets_1_1SR__div2k.html#a6f5f65f5cbbade9f9cb98ea0037a541c',1,'cv::datasets::SR_div2k::load()'],['https://docs.opencv.org/4.2.0/d5/d19/classcv_1_1datasets_1_1SR__general100.html#a56fe96bac637d69ab01b8a815395d21d',1,'cv::datasets::SR_general100::load()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a7b05db6110aec2246f2b31363937539c',1,'cv::ml::SVM::load()'],['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a6945188e89c36b33187ab57dbc2364dc',1,'cv::ml::SVMSGD::load()'],['https://docs.opencv.org/4.2.0/d7/dc3/classcv_1_1datasets_1_1TR__chars.html#a4f357a12c26753335f5d7ff90f9cae3d',1,'cv::datasets::TR_chars::load()'],['https://docs.opencv.org/4.2.0/d7/dfb/classcv_1_1datasets_1_1TR__icdar.html#a803e5f1bfddaa201506204c51fb01f3d',1,'cv::datasets::TR_icdar::load()'],['https://docs.opencv.org/4.2.0/da/dc9/classcv_1_1datasets_1_1TR__svt.html#af4293f31c65df7994d06ccd06a57dd8d',1,'cv::datasets::TR_svt::load()'],['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a2518906ab9f5a89984f039fc737934d9',1,'cv::datasets::TRACK_alov::load()'],['https://docs.opencv.org/4.2.0/dc/d52/classcv_1_1datasets_1_1TRACK__vot.html#ac7dffefce0a572517d46728eddb76e74',1,'cv::datasets::TRACK_vot::load()']]], - ['load_20and_20display_20an_20image_290',['Load and Display an Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'']]], - ['load_20caffe_20framework_20models_291',['Load Caffe framework models',['https://docs.opencv.org/4.2.0/d5/de7/tutorial_dnn_googlenet.html',1,'']]], - ['load_20modify_20and_20save_20an_20image_292',['Load, Modify, and Save an Image',['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'']]], - ['load_5fauto_293',['LOAD_AUTO',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a0282a666ca11b5ae82b3eaf57e28ac45abc0ec20ee29622eb7d340b8da60c644f',1,'cv::viz::Mesh']]], - ['load_5ffactor_294',['load_factor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#add961e22f4549e2c94846946fbd25a7d',1,'std::unordered_map::load_factor()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a02888ba9dce21c5e16ba09734ebdb642',1,'std::unordered_multimap::load_factor()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a4105eeac8ec00dc431b408e8d046dd5e',1,'std::unordered_multiset::load_factor()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a6e7300347a4173c3ad35217600d28f50',1,'std::unordered_set::load_factor()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#add961e22f4549e2c94846946fbd25a7d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::load_factor()']]], - ['load_5fobj_295',['LOAD_OBJ',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a0282a666ca11b5ae82b3eaf57e28ac45ac0b9804b46088d052fc6ea4aff94ed7b',1,'cv::viz::Mesh']]], - ['load_5fply_296',['LOAD_PLY',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a0282a666ca11b5ae82b3eaf57e28ac45a7874520d2defcbccddf5032359171385',1,'cv::viz::Mesh']]], - ['load_5fsave_5fimage_2emarkdown_297',['load_save_image.markdown',['https://docs.opencv.org/4.2.0/d2/d4f/load__save__image_8markdown.html',1,'']]], - ['loadannotatedonly_298',['loadAnnotatedOnly',['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a19bb9f5aae3ffdbf6b4b770e7b63ef98',1,'cv::datasets::TRACK_alov']]], - ['loadclassifiernm1_299',['loadClassifierNM1',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga8a0e90a70de747b993be34ed7933ef53',1,'cv::text::loadClassifierNM1()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga8a0e90a70de747b993be34ed7933ef53',1,'loadClassifierNM1()(Global Namespace)']]], - ['loadclassifiernm2_300',['loadClassifierNM2',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga7a7555ebd0850765e1cb09d322235cf8',1,'cv::text::loadClassifierNM2()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga7a7555ebd0850765e1cb09d322235cf8',1,'loadClassifierNM2()(Global Namespace)']]], - ['loaddatasetlist_301',['loadDatasetList',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#ga02020fc9f387bb043a478fe5f112bb8d',1,'cv::face::loadDatasetList()'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#ga02020fc9f387bb043a478fe5f112bb8d',1,'loadDatasetList()(Global Namespace)']]], - ['loadfacepoints_302',['loadFacePoints',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gab70c6fb08756f867d6160099907202a5',1,'cv::face::loadFacePoints()'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gab70c6fb08756f867d6160099907202a5',1,'loadFacePoints()(Global Namespace)']]], - ['loadfontdata_303',['loadFontData',['https://docs.opencv.org/4.2.0/d9/dfa/classcv_1_1freetype_1_1FreeType2.html#af059d49b806b916ffdd6380b9eb2f59a',1,'cv::freetype::FreeType2']]], - ['loadfromcsv_304',['loadFromCSV',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#ab3264a32194126ff8d6821e76018cde3',1,'cv::ml::TrainData']]], - ['loadfromstring_305',['loadFromString',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a3ba305a10d02479c13cf7d169c321547',1,'cv::Algorithm']]], - ['loadimages_306',['loadImages',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#ab4094252884b5da9d5f33fcaea29bb09',1,'cv::multicalib::MultiCameraCalibration']]], - ['loadmodel_307',['loadModel',['https://docs.opencv.org/4.2.0/db/dd8/classcv_1_1face_1_1Facemark.html#a43fafd5248ab26db7cbdd8bf5a4f8266',1,'cv::face::Facemark']]], - ['loadnet_308',['loadNet',['https://docs.opencv.org/4.2.0/d7/d8d/classcv_1_1cnn__3dobj_1_1descriptorExtractor.html#a2b758899b6f1f6adfb2c772938943df2',1,'cv::cnn_3dobj::descriptorExtractor']]], - ['loadocrbeamsearchclassifiercnn_309',['loadOCRBeamSearchClassifierCNN',['https://docs.opencv.org/4.2.0/d8/de7/namespacecv_1_1text.html#ac30595bd0b171889aee9f3f62f0b966e',1,'cv::text']]], - ['loadocrhmmclassifier_310',['loadOCRHMMClassifier',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga1d0cf1516cf8cfb2e53fdf639d547119',1,'cv::text::loadOCRHMMClassifier()'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga1d0cf1516cf8cfb2e53fdf639d547119',1,'loadOCRHMMClassifier()(Global Namespace)']]], - ['loadocrhmmclassifiercnn_311',['loadOCRHMMClassifierCNN',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga8368b390a06f0323f9dead526337f6a3',1,'cv::text::loadOCRHMMClassifierCNN()'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga8368b390a06f0323f9dead526337f6a3',1,'loadOCRHMMClassifierCNN()(Global Namespace)']]], - ['loadocrhmmclassifiernm_312',['loadOCRHMMClassifierNM',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gad20627dd74a441192dc327adc9f9356d',1,'cv::text::loadOCRHMMClassifierNM()'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gad20627dd74a441192dc327adc9f9356d',1,'loadOCRHMMClassifierNM()(Global Namespace)']]], - ['loadparameters_313',['loadParameters',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga9dc72c2a623574a50d553d3b2ffd4e52',1,'cv::stereo::QuasiDenseStereo::loadParameters()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga9dc72c2a623574a50d553d3b2ffd4e52',1,'loadParameters()(Global Namespace)']]], - ['loadpattern_314',['loadPattern',['https://docs.opencv.org/4.2.0/df/d8d/classcv_1_1randpattern_1_1RandomPatternCornerFinder.html#a56c6e69acc77b059df1e31ab3165e64a',1,'cv::randpattern::RandomPatternCornerFinder::loadPattern(const cv::Mat &patternImage)'],['https://docs.opencv.org/4.2.0/df/d8d/classcv_1_1randpattern_1_1RandomPatternCornerFinder.html#aeb584b73b5d3458bb09a115a6a676f8e',1,'cv::randpattern::RandomPatternCornerFinder::loadPattern(const cv::Mat &patternImage, const std::vector< cv::KeyPoint > &patternKeyPoints, const cv::Mat &patternDescriptors)']]], - ['loadplysimple_315',['loadPLYSimple',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gad893719cc47a72b24482f2bfdebb409e',1,'cv::ppf_match_3d::loadPLYSimple()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gad893719cc47a72b24482f2bfdebb409e',1,'loadPLYSimple()(Global Namespace)']]], - ['loadtrainingdata_316',['loadTrainingData',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gacd36ecb8de65bd12d8420d4a0ae98a4b',1,'cv::face::loadTrainingData(String filename, std::vector< String > &images, OutputArray facePoints, char delim=' ', float offset=0.0f)'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#ga9bbdd4136cc1eee55586b5f115d8a3a8',1,'cv::face::loadTrainingData(String imageList, String groundTruth, std::vector< String > &images, OutputArray facePoints, float offset=0.0f)'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gac3a2d046686d932425d2601b640d97d3',1,'cv::face::loadTrainingData(std::vector< String > filename, std::vector< std::vector< Point2f > > &trainlandmarks, std::vector< String > &trainimages)'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gacd36ecb8de65bd12d8420d4a0ae98a4b',1,'loadTrainingData(String filename, std::vector< String > &images, OutputArray facePoints, char delim=' ', float offset=0.0f)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#ga9bbdd4136cc1eee55586b5f115d8a3a8',1,'loadTrainingData(String imageList, String groundTruth, std::vector< String > &images, OutputArray facePoints, float offset=0.0f)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gac3a2d046686d932425d2601b640d97d3',1,'loadTrainingData(std::vector< String > filename, std::vector< std::vector< Point2f > > &trainlandmarks, std::vector< String > &trainimages)(Global Namespace)']]], - ['loadwindowparameters_317',['loadWindowParameters',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga8e6806c75e016cf22d998b4d454b3bfd',1,'cv::loadWindowParameters()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga8e6806c75e016cf22d998b4d454b3bfd',1,'loadWindowParameters()(Global Namespace)']]], - ['local_318',['Local',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#ae99e4f30c874011acee657294d077b36',1,'cv::ocl::KernelArg']]], - ['local_319',['LOCAL',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a1010adb068498c191b8079323ad790f9a635cd42ccd784e7c833a2d335bf483bf',1,'cv::ocl::KernelArg']]], - ['local_20features_20matching_320',['AKAZE local features matching',['https://docs.opencv.org/4.2.0/db/d70/tutorial_akaze_matching.html',1,'']]], - ['local_5fis_5fglobal_321',['LOCAL_IS_GLOBAL',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a863c26836094911821d04c7e105e4733ac4e8cafe65632d793cec03066db2c598',1,'cv::ocl::Device']]], - ['local_5fis_5flocal_322',['LOCAL_IS_LOCAL',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a863c26836094911821d04c7e105e4733affd140fc55eece28a64ce7e002fcab8d',1,'cv::ocl::Device']]], - ['local_5fiterator_323',['local_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aab940536a56eb520d8e7143ce5c4af3a',1,'std::unordered_map::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aab940536a56eb520d8e7143ce5c4af3a',1,'std::unordered_map::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a8cb5d0ca110f847b3fceed2d07472710',1,'std::unordered_multimap::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a8cb5d0ca110f847b3fceed2d07472710',1,'std::unordered_multimap::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a2b13af1127b00c668e4e277c0053c2c3',1,'std::unordered_multiset::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a2b13af1127b00c668e4e277c0053c2c3',1,'std::unordered_multiset::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a41daefac0150734553a1b8ae994520e6',1,'std::unordered_set::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a41daefac0150734553a1b8ae994520e6',1,'std::unordered_set::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aab940536a56eb520d8e7143ce5c4af3a',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aab940536a56eb520d8e7143ce5c4af3a',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::local_iterator']]], - ['local_5fmaxima_324',['local_maxima',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a07d1fb6d7d3ea7c129cedc76a2589ad4',1,'cv::text::ERStat']]], - ['localadaptintegration_5fk_325',['localAdaptintegration_k',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a1246bbabc4fe4ddb24c8bce5f62bdf33',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters']]], - ['localadaptintegration_5ftau_326',['localAdaptintegration_tau',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#addc4f8df07a7e35b6eaf59ec167cdbf3',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters']]], - ['localbinarizationmethods_327',['LocalBinarizationMethods',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a77765f3d60539a658097c1dd8faedf24',1,'cv::ximgproc']]], - ['locale_328',['locale',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html',1,'std::locale'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00101.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#af149bfda05282c1f7c62973c887d77e6',1,'std::locale::locale()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#ade071b7e4275c4a8889b09e86d1c26fb',1,'std::locale::locale(const locale &__other)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a268965d97cffcf472d2f0fa8b74aa1e2',1,'std::locale::locale(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a964af00c8b1c09375ca7abd5bdf8922f',1,'std::locale::locale(const locale &__base, const char *__s, category __cat)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a85e91d15c668e3455ff2a1eda4e6784a',1,'std::locale::locale(const std::string &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a918d906d5f6fc923db96a72021ad5aab',1,'std::locale::locale(const locale &__base, const std::string &__s, category __cat)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#af050b38ebd4f015ef0fe4b64f3087d42',1,'std::locale::locale(const locale &__base, const locale &__add, category __cat)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a9a3183dbb40c79006a1de940775ce704',1,'std::locale::locale(const locale &__other, _Facet *__f)']]], - ['locale_5fclasses_2eh_329',['locale_classes.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00395.html',1,'']]], - ['locale_5fclasses_2etcc_330',['locale_classes.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00398.html',1,'']]], - ['locale_5fconv_2eh_331',['locale_conv.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00401.html',1,'']]], - ['locale_5ffacets_2eh_332',['locale_facets.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00404.html',1,'']]], - ['locale_5ffacets_2etcc_333',['locale_facets.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00407.html',1,'']]], - ['locale_5ffacets_5fnonio_2eh_334',['locale_facets_nonio.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00410.html',1,'']]], - ['locale_5ffacets_5fnonio_2etcc_335',['locale_facets_nonio.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00413.html',1,'']]], - ['localefwd_2eh_336',['localefwd.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00416.html',1,'']]], - ['localenergy_5fspatialconstant_337',['localEnergy_spatialConstant',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#a187f15eb270d566533d9684a66f5a691',1,'cv::bioinspired::SegmentationParameters']]], - ['localenergy_5ftemporalconstant_338',['localEnergy_temporalConstant',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#a89acec017f2fc4fbc03f6ecd281c4185',1,'cv::bioinspired::SegmentationParameters']]], - ['locales_339',['Locales',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01498.html',1,'']]], - ['localmemsize_340',['localMemSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a92e2c210bf5f352d2a742434aca02271',1,'cv::ocl::Device::localMemSize()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a9a22e8dbd4fd080ac2c1946d1bae220c',1,'cv::ocl::Kernel::localMemSize()']]], - ['localmemtype_341',['localMemType',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a610127a076485b2179bb4bcd25c46f56',1,'cv::ocl::Device']]], - ['locate_342',['locate',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aec8f1fd5a802f62faa97520b465897d7',1,'cv::Subdiv2D']]], - ['locateroi_343',['locateROI',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a934d25560bfb1f03c0077e437d41e0cb',1,'cv::cuda::GpuMat::locateROI()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a40b5b3371a9c2a4b2b8ce0c8068d7c96',1,'cv::Mat::locateROI()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a657631fc34ff89a3e2e921122c45c667',1,'cv::UMat::locateROI()']]], - ['location_344',['location',['https://docs.opencv.org/4.2.0/d1/dda/structcv_1_1DetectionBasedTracker_1_1ExtObject.html#ae35c2f8e432191e876da162978ffdbfb',1,'cv::DetectionBasedTracker::ExtObject']]], - ['location_20in_20subpixels_345',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], - ['location_5frow_346',['LOCATION_ROW',['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#addb10a677428002c0202178578f1cc25',1,'cv::cuda::FastFeatureDetector']]], - ['locations_347',['locations',['https://docs.opencv.org/4.2.0/d3/d34/structcv_1_1DetectionROI.html#a9e3ba3daa336f41774e72b8ee2787876',1,'cv::DetectionROI']]], - ['lock_348',['lock',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#afd0d8141835b66eb92cd65c4d2f25b51',1,'cv::UMatData::lock()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a82fa606b1427f731ac64bb8ac49221f3',1,'std::lock()']]], - ['lock_2eprivate_2ehpp_349',['lock.private.hpp',['https://docs.opencv.org/4.2.0/d2/d1a/lock_8private_8hpp.html',1,'']]], - ['lock_5fguard_350',['lock_guard',['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1utils_1_1lock__guard.html',1,'cv::utils::lock_guard< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07207.html',1,'std::lock_guard< class >'],['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1utils_1_1lock__guard.html#a2ba70ea4aedbf1a96de94be8dfa0b7c2',1,'cv::utils::lock_guard::lock_guard()']]], - ['log_351',['log',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a61821aff05bfa68006c5a960bef5d238',1,'cv::videostab::StabilizerBase::log()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a4dc57b319fc1cf8c9035016e56602a7d',1,'Eigen::MatrixBase::log()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a4dc57b319fc1cf8c9035016e56602a7d',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::log()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a4dc57b319fc1cf8c9035016e56602a7d',1,'MatrixBase< Solve< Decomposition, RhsType > >::log()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae5de78ee278fe88405c6dbc38502f7c1',1,'cv::log(const softfloat &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga54b0b6e1873fb3a4b1db47252d79b8d3',1,'cv::log(const softdouble &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga937ecdce4679a77168730830a955bea7',1,'cv::log(InputArray src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gaae9c60739e2d1a977b4d3250a0be42ca',1,'cv::cuda::log()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08539cfb85017a1c48505908d55e137b',1,'cv::cudev::log(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaeab3883c578b3e6fe8ebf29dbcfdcf9',1,'cv::cudev::log(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac42b7d2fece624ad6ed6eaae3d50dfb1',1,'cv::cudev::log(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eebb9ca628f9c4d629740d9b1c38bca',1,'cv::cudev::log(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaadf7d6ad25906b309fa822fd4a4a16a',1,'cv::cudev::log(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ea65e4bfdfe10dadd150b658cbfccb2',1,'cv::cudev::log(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e961864775dc92330f5713d0981e554',1,'cv::cudev::log(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd19caa726a85fae1b400fe1660713f4',1,'cv::cudev::log(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae44cc350406e393060be02ebd1526808',1,'cv::cudev::log(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35c865dcd20b2af38c11c50a8c6b2be7',1,'cv::cudev::log(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf424c0846ae2028055cbe5e85195c8e0',1,'cv::cudev::log(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga116165f0cdd7f56b58e374dec6a65d41',1,'cv::cudev::log(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94cd6c21b8065a839d1ea04d1bad63fa',1,'cv::cudev::log(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23d270d966b55005aa42fa732ca91fbd',1,'cv::cudev::log(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7623fbca3fbca124c13443cf1723b808',1,'cv::cudev::log(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98bd27047780975443e4f6e130e3dda',1,'cv::cudev::log(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4db909814e37255641a8e93e419fc69f',1,'cv::cudev::log(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3994783ad220e421e7ad289e1a54edd0',1,'cv::cudev::log(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fdb2dfc034c831469ab4c5a6393a4df',1,'cv::cudev::log(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdb321b25c6693af8f074a7a60e3a465',1,'cv::cudev::log(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf34f4fdce0642c4fd19b54aab55e81c',1,'cv::cudev::log(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a0198cbd63755cc27e161f15ec58f10',1,'cv::cudev::log(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04f5e5c1b5501958b548a8556018a96a',1,'cv::cudev::log(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a2f6d0839322b502807f2dafd14e4e1',1,'cv::cudev::log(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac522a70418ee8a7a615161c34e107584',1,'cv::cudev::log(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab52151ba258ab3520c79a74bdc05ba88',1,'cv::cudev::log(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac17e2aa1d718d5d66415928ba6126790',1,'cv::cudev::log(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9838971ae145cd904cea0dca62b44a0b',1,'cv::cudev::log(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfcc2d88806c052b4286760fbd509eb6',1,'cv::cudev::log(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga218099ad9af6e76a22531117d4612851',1,'cv::cudev::log(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9360486e5b048b473e854e751baa7e4',1,'cv::cudev::log(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e013413fdd351af4efffff15c0201d',1,'cv::cudev::log(const double4 &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga937ecdce4679a77168730830a955bea7',1,'log(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae5de78ee278fe88405c6dbc38502f7c1',1,'log(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga54b0b6e1873fb3a4b1db47252d79b8d3',1,'log(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gaae9c60739e2d1a977b4d3250a0be42ca',1,'log(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08539cfb85017a1c48505908d55e137b',1,'log(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaeab3883c578b3e6fe8ebf29dbcfdcf9',1,'log(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac42b7d2fece624ad6ed6eaae3d50dfb1',1,'log(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eebb9ca628f9c4d629740d9b1c38bca',1,'log(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaadf7d6ad25906b309fa822fd4a4a16a',1,'log(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ea65e4bfdfe10dadd150b658cbfccb2',1,'log(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e961864775dc92330f5713d0981e554',1,'log(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd19caa726a85fae1b400fe1660713f4',1,'log(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae44cc350406e393060be02ebd1526808',1,'log(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35c865dcd20b2af38c11c50a8c6b2be7',1,'log(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf424c0846ae2028055cbe5e85195c8e0',1,'log(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga116165f0cdd7f56b58e374dec6a65d41',1,'log(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94cd6c21b8065a839d1ea04d1bad63fa',1,'log(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23d270d966b55005aa42fa732ca91fbd',1,'log(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7623fbca3fbca124c13443cf1723b808',1,'log(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98bd27047780975443e4f6e130e3dda',1,'log(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4db909814e37255641a8e93e419fc69f',1,'log(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3994783ad220e421e7ad289e1a54edd0',1,'log(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fdb2dfc034c831469ab4c5a6393a4df',1,'log(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdb321b25c6693af8f074a7a60e3a465',1,'log(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf34f4fdce0642c4fd19b54aab55e81c',1,'log(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a0198cbd63755cc27e161f15ec58f10',1,'log(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04f5e5c1b5501958b548a8556018a96a',1,'log(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a2f6d0839322b502807f2dafd14e4e1',1,'log(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac522a70418ee8a7a615161c34e107584',1,'log(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab52151ba258ab3520c79a74bdc05ba88',1,'log(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac17e2aa1d718d5d66415928ba6126790',1,'log(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9838971ae145cd904cea0dca62b44a0b',1,'log(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfcc2d88806c052b4286760fbd509eb6',1,'log(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga218099ad9af6e76a22531117d4612851',1,'log(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9360486e5b048b473e854e751baa7e4',1,'log(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e013413fdd351af4efffff15c0201d',1,'log(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga42f2de63a5c18a149f94b926d4d6bb21',1,'std::log()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga42f2de63a5c18a149f94b926d4d6bb21',1,'log()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae8bb75ba4f5f30a7571146dbfa653c6d',1,'Eigen::log()']]], - ['log_2ehpp_352',['log.hpp',['https://docs.opencv.org/4.2.0/d4/d3d/log_8hpp.html',1,'']]], - ['log10_353',['log10',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d7f752d82c289caa24bbb5a278ac31d',1,'cv::cudev::log10(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f5cc2406a29379d2a8baf217afd6771',1,'cv::cudev::log10(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga885bb7ec4778055a672d8d1804e89c83',1,'cv::cudev::log10(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ba08a48039960de46e02eb8cd2f75f7',1,'cv::cudev::log10(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e2344af6c50f3ff3cbe67a5f4c56263',1,'cv::cudev::log10(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4ee0839d0b5ce07fb2ee0a79c798a7f',1,'cv::cudev::log10(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9aa7df33af81be99a8d22ea4a0f96d6',1,'cv::cudev::log10(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbefd60fcb108477d45f6080dbd51586',1,'cv::cudev::log10(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20752f0ddffd9bafb163a72bc655d207',1,'cv::cudev::log10(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga707a022d851b055fe0decd844a611029',1,'cv::cudev::log10(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade43b36347b2f0aaf59e3a4b970c0a69',1,'cv::cudev::log10(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddf09f912c40d8e70bbd8b45a36f1142',1,'cv::cudev::log10(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0bf8ec1996e77e126443790887c9752',1,'cv::cudev::log10(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga348e21a5e5da04325fa534417ab2a30c',1,'cv::cudev::log10(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab1b7872f35256389dcaff634d54606f',1,'cv::cudev::log10(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga498eb71a49f4e18b369ec334987679b9',1,'cv::cudev::log10(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32295f0c1b1c66e85b6c1fc5e45bea2e',1,'cv::cudev::log10(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga623a9fd76452b82cc8400dbcd76a393a',1,'cv::cudev::log10(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcac50339c24b2ba6ce3684bcff5a804',1,'cv::cudev::log10(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1a2eaab43233ef945690875e04145a6',1,'cv::cudev::log10(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga081b555d0461f416b7922f5e7554eb9e',1,'cv::cudev::log10(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac58ed812725e53e979f66bbbd8d23c7e',1,'cv::cudev::log10(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga789314f8325f905eab00ab6053d7535a',1,'cv::cudev::log10(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f229460ea5ea56194553ffcaf515d5a',1,'cv::cudev::log10(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42ad6387243d672cddf22363b235e03d',1,'cv::cudev::log10(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4206efef60aa6afb81347138c7bb94',1,'cv::cudev::log10(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b13e9d0bdaf5f938175766fb88c6ba9',1,'cv::cudev::log10(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bc4919079c485e785b67ccc0e52753d',1,'cv::cudev::log10(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c5738ee979615242de5cb51f459f110',1,'cv::cudev::log10(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40389fe08e2f0f7a30a2da84c4de4b5b',1,'cv::cudev::log10(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefb429f0854a5dfc8dc864d2d6f57da2',1,'cv::cudev::log10(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54055600516173a28ca0a695fca1fac1',1,'cv::cudev::log10(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d7f752d82c289caa24bbb5a278ac31d',1,'log10(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f5cc2406a29379d2a8baf217afd6771',1,'log10(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga885bb7ec4778055a672d8d1804e89c83',1,'log10(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ba08a48039960de46e02eb8cd2f75f7',1,'log10(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e2344af6c50f3ff3cbe67a5f4c56263',1,'log10(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4ee0839d0b5ce07fb2ee0a79c798a7f',1,'log10(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9aa7df33af81be99a8d22ea4a0f96d6',1,'log10(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbefd60fcb108477d45f6080dbd51586',1,'log10(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20752f0ddffd9bafb163a72bc655d207',1,'log10(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga707a022d851b055fe0decd844a611029',1,'log10(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade43b36347b2f0aaf59e3a4b970c0a69',1,'log10(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddf09f912c40d8e70bbd8b45a36f1142',1,'log10(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0bf8ec1996e77e126443790887c9752',1,'log10(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga348e21a5e5da04325fa534417ab2a30c',1,'log10(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab1b7872f35256389dcaff634d54606f',1,'log10(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga498eb71a49f4e18b369ec334987679b9',1,'log10(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32295f0c1b1c66e85b6c1fc5e45bea2e',1,'log10(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga623a9fd76452b82cc8400dbcd76a393a',1,'log10(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcac50339c24b2ba6ce3684bcff5a804',1,'log10(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1a2eaab43233ef945690875e04145a6',1,'log10(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga081b555d0461f416b7922f5e7554eb9e',1,'log10(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac58ed812725e53e979f66bbbd8d23c7e',1,'log10(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga789314f8325f905eab00ab6053d7535a',1,'log10(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f229460ea5ea56194553ffcaf515d5a',1,'log10(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42ad6387243d672cddf22363b235e03d',1,'log10(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4206efef60aa6afb81347138c7bb94',1,'log10(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b13e9d0bdaf5f938175766fb88c6ba9',1,'log10(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bc4919079c485e785b67ccc0e52753d',1,'log10(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c5738ee979615242de5cb51f459f110',1,'log10(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40389fe08e2f0f7a30a2da84c4de4b5b',1,'log10(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefb429f0854a5dfc8dc864d2d6f57da2',1,'log10(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54055600516173a28ca0a695fca1fac1',1,'log10(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga070941f6cb66b0e4619891010c008250',1,'std::log10()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga070941f6cb66b0e4619891010c008250',1,'log10()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a25256faeec3ffd0f3615a0e1e45dfb14',1,'Eigen::log10()']]], - ['log10_5f_354',['log10_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9255b842159fcf1ba4097b4b49284eae',1,'cv::cudev::log10_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9255b842159fcf1ba4097b4b49284eae',1,'log10_()(Global Namespace)']]], - ['log10_5ffunc_355',['log10_func',['https://docs.opencv.org/4.2.0/d8/da8/structcv_1_1cudev_1_1log10__func.html',1,'cv::cudev']]], - ['log10_5ffunc_3c_20double_20_3e_356',['log10_func< double >',['https://docs.opencv.org/4.2.0/dc/d32/structcv_1_1cudev_1_1log10__func_3_01double_01_4.html',1,'cv::cudev']]], - ['log10_5ffunc_3c_20float_20_3e_357',['log10_func< float >',['https://docs.opencv.org/4.2.0/d0/d42/structcv_1_1cudev_1_1log10__func_3_01float_01_4.html',1,'cv::cudev']]], - ['log10_5ffunc_3c_20schar_20_3e_358',['log10_func< schar >',['https://docs.opencv.org/4.2.0/dd/d4b/structcv_1_1cudev_1_1log10__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['log10_5ffunc_3c_20short_20_3e_359',['log10_func< short >',['https://docs.opencv.org/4.2.0/d9/d00/structcv_1_1cudev_1_1log10__func_3_01short_01_4.html',1,'cv::cudev']]], - ['log10_5ffunc_3c_20uchar_20_3e_360',['log10_func< uchar >',['https://docs.opencv.org/4.2.0/dd/dcc/structcv_1_1cudev_1_1log10__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['log10_5ffunc_3c_20uint_20_3e_361',['log10_func< uint >',['https://docs.opencv.org/4.2.0/df/d6e/structcv_1_1cudev_1_1log10__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['log10_5ffunc_3c_20ushort_20_3e_362',['log10_func< ushort >',['https://docs.opencv.org/4.2.0/d0/df1/structcv_1_1cudev_1_1log10__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['log1p_363',['log1p',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ac5c8a2cded6b59628f2de04f24d2fff4',1,'Eigen']]], - ['log2_364',['Log2',['https://docs.opencv.org/4.2.0/d5/da6/structcv_1_1cudev_1_1Log2.html',1,'cv::cudev']]], - ['log2_365',['log2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af298b9380058e91b466225dd4da95b',1,'cv::cudev::log2(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84accb697a90868cc966ae3d78f8088b',1,'cv::cudev::log2(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f96d1e89c07ea9b34159ee293577317',1,'cv::cudev::log2(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1d0331e894382a5288768bee795f70e',1,'cv::cudev::log2(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga092163e53624a085da2281618a7c8993',1,'cv::cudev::log2(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2648fce709533184caa8e046651c30f2',1,'cv::cudev::log2(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a796696b3b511da92ab22fd89d9c3eb',1,'cv::cudev::log2(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ab6c123ba4a2bcbbcfcc333d46ed84a',1,'cv::cudev::log2(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d8cc2b3a27d520f1cab2149bbdee856',1,'cv::cudev::log2(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa48b21b8043d227d2cfb7eeaea0fd223',1,'cv::cudev::log2(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7088ac0261fc793473797fd16fc4fa32',1,'cv::cudev::log2(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0893395683ac8f446357c5c78aca45',1,'cv::cudev::log2(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f139df681666d15bb68cbef046853ee',1,'cv::cudev::log2(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ce2b6db24956d2d3298ed5e58ec4c70',1,'cv::cudev::log2(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac17ee8fc39724da14517c0a5bce64348',1,'cv::cudev::log2(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75aa279efb8d46242a63fad03e1d19c1',1,'cv::cudev::log2(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6886c5775cd56741faa0724a19e6695',1,'cv::cudev::log2(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga674d3cfe043cfffab22e6ae8bc6652e2',1,'cv::cudev::log2(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8114a66542a3392bc0e79f06bb4d186',1,'cv::cudev::log2(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62966501aa6c0fe9bec42eb26d00ae8a',1,'cv::cudev::log2(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga000821a347070e9dce650e634d07812c',1,'cv::cudev::log2(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcd61eab552c49a1247e6e23e0898297',1,'cv::cudev::log2(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03065945aac3211c265db654c39e6dc9',1,'cv::cudev::log2(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5881314f1fb87883c129c0bf9730d3c',1,'cv::cudev::log2(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga585e2ee38f000c0419d6940ee7824048',1,'cv::cudev::log2(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d36bd4b3ce78779f972805992dfe19c',1,'cv::cudev::log2(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6646bc72c8a3312d547105b3b787a28',1,'cv::cudev::log2(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5fa31e95f99bf4d0e39ec7374bc9add',1,'cv::cudev::log2(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbf81d98455601fea8a5eedee7e6bd53',1,'cv::cudev::log2(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga870a9ffd33e83157c00439289f666fe4',1,'cv::cudev::log2(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06fb539e7d65165a8e5ccbdeac4a63ad',1,'cv::cudev::log2(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd1e01e7ec3a0d09753c4c072375460',1,'cv::cudev::log2(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af298b9380058e91b466225dd4da95b',1,'log2(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84accb697a90868cc966ae3d78f8088b',1,'log2(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f96d1e89c07ea9b34159ee293577317',1,'log2(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1d0331e894382a5288768bee795f70e',1,'log2(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga092163e53624a085da2281618a7c8993',1,'log2(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2648fce709533184caa8e046651c30f2',1,'log2(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a796696b3b511da92ab22fd89d9c3eb',1,'log2(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ab6c123ba4a2bcbbcfcc333d46ed84a',1,'log2(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d8cc2b3a27d520f1cab2149bbdee856',1,'log2(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa48b21b8043d227d2cfb7eeaea0fd223',1,'log2(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7088ac0261fc793473797fd16fc4fa32',1,'log2(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0893395683ac8f446357c5c78aca45',1,'log2(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f139df681666d15bb68cbef046853ee',1,'log2(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ce2b6db24956d2d3298ed5e58ec4c70',1,'log2(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac17ee8fc39724da14517c0a5bce64348',1,'log2(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75aa279efb8d46242a63fad03e1d19c1',1,'log2(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6886c5775cd56741faa0724a19e6695',1,'log2(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga674d3cfe043cfffab22e6ae8bc6652e2',1,'log2(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8114a66542a3392bc0e79f06bb4d186',1,'log2(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62966501aa6c0fe9bec42eb26d00ae8a',1,'log2(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga000821a347070e9dce650e634d07812c',1,'log2(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcd61eab552c49a1247e6e23e0898297',1,'log2(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03065945aac3211c265db654c39e6dc9',1,'log2(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5881314f1fb87883c129c0bf9730d3c',1,'log2(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga585e2ee38f000c0419d6940ee7824048',1,'log2(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d36bd4b3ce78779f972805992dfe19c',1,'log2(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6646bc72c8a3312d547105b3b787a28',1,'log2(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5fa31e95f99bf4d0e39ec7374bc9add',1,'log2(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbf81d98455601fea8a5eedee7e6bd53',1,'log2(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga870a9ffd33e83157c00439289f666fe4',1,'log2(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06fb539e7d65165a8e5ccbdeac4a63ad',1,'log2(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd1e01e7ec3a0d09753c4c072375460',1,'log2(const double4 &a)(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad2d0241ffaaa3b0b04ec70b59ab066d4',1,'Eigen::log2()']]], - ['log2_3c_20n_2c_200_2c_20count_20_3e_366',['Log2< N, 0, COUNT >',['https://docs.opencv.org/4.2.0/d5/d16/structcv_1_1cudev_1_1Log2_3_01N_00_010_00_01COUNT_01_4.html',1,'cv::cudev']]], - ['log2_5f_367',['log2_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e7ce936100b248a5704a561dd485536',1,'cv::cudev::log2_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e7ce936100b248a5704a561dd485536',1,'log2_()(Global Namespace)']]], - ['log2_5ffunc_368',['log2_func',['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1cudev_1_1log2__func.html',1,'cv::cudev']]], - ['log2_5ffunc_3c_20double_20_3e_369',['log2_func< double >',['https://docs.opencv.org/4.2.0/dc/d17/structcv_1_1cudev_1_1log2__func_3_01double_01_4.html',1,'cv::cudev']]], - ['log2_5ffunc_3c_20float_20_3e_370',['log2_func< float >',['https://docs.opencv.org/4.2.0/db/dba/structcv_1_1cudev_1_1log2__func_3_01float_01_4.html',1,'cv::cudev']]], - ['log2_5ffunc_3c_20schar_20_3e_371',['log2_func< schar >',['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1log2__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['log2_5ffunc_3c_20short_20_3e_372',['log2_func< short >',['https://docs.opencv.org/4.2.0/d6/d0b/structcv_1_1cudev_1_1log2__func_3_01short_01_4.html',1,'cv::cudev']]], - ['log2_5ffunc_3c_20uchar_20_3e_373',['log2_func< uchar >',['https://docs.opencv.org/4.2.0/d6/d41/structcv_1_1cudev_1_1log2__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['log2_5ffunc_3c_20uint_20_3e_374',['log2_func< uint >',['https://docs.opencv.org/4.2.0/df/d69/structcv_1_1cudev_1_1log2__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['log2_5ffunc_3c_20ushort_20_3e_375',['log2_func< ushort >',['https://docs.opencv.org/4.2.0/d0/dda/structcv_1_1cudev_1_1log2__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['log32f_376',['log32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2b1d931c2cdadf3623d57a853b370147',1,'cv::hal::log32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2b1d931c2cdadf3623d57a853b370147',1,'log32f()(Global Namespace)']]], - ['log64f_377',['log64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3c28878c1a05aabd1bca73992346c88f',1,'cv::hal::log64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3c28878c1a05aabd1bca73992346c88f',1,'log64f()(Global Namespace)']]], - ['log_5f_378',['log_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a3d134bf4df68ce2a559d5d69fb187c88',1,'cv::videostab::StabilizerBase::log_'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe5e4a19d566fae00ec99edba171c767',1,'cv::cudev::log_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe5e4a19d566fae00ec99edba171c767',1,'log_()(Global Namespace)']]], - ['log_5feps_379',['log_eps',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#ab4fc6b7c1555341b0ceb0f4774e5e8d1',1,'cv::line_descriptor::LSDParam']]], - ['log_5ffunc_380',['log_func',['https://docs.opencv.org/4.2.0/dc/d41/structcv_1_1cudev_1_1log__func.html',1,'cv::cudev']]], - ['log_5ffunc_3c_20double_20_3e_381',['log_func< double >',['https://docs.opencv.org/4.2.0/dd/dad/structcv_1_1cudev_1_1log__func_3_01double_01_4.html',1,'cv::cudev']]], - ['log_5ffunc_3c_20float_20_3e_382',['log_func< float >',['https://docs.opencv.org/4.2.0/d2/d85/structcv_1_1cudev_1_1log__func_3_01float_01_4.html',1,'cv::cudev']]], - ['log_5ffunc_3c_20schar_20_3e_383',['log_func< schar >',['https://docs.opencv.org/4.2.0/d2/de1/structcv_1_1cudev_1_1log__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['log_5ffunc_3c_20short_20_3e_384',['log_func< short >',['https://docs.opencv.org/4.2.0/d0/d19/structcv_1_1cudev_1_1log__func_3_01short_01_4.html',1,'cv::cudev']]], - ['log_5ffunc_3c_20uchar_20_3e_385',['log_func< uchar >',['https://docs.opencv.org/4.2.0/d3/db5/structcv_1_1cudev_1_1log__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['log_5ffunc_3c_20uint_20_3e_386',['log_func< uint >',['https://docs.opencv.org/4.2.0/d0/dee/structcv_1_1cudev_1_1log__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['log_5ffunc_3c_20ushort_20_3e_387',['log_func< ushort >',['https://docs.opencv.org/4.2.0/d5/d0c/structcv_1_1cudev_1_1log__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['log_5flevel_5fdebug_388',['LOG_LEVEL_DEBUG',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9a9ddbf3b53deed46c6c946288e9981bac',1,'cv::utils::logging']]], - ['log_5flevel_5ferror_389',['LOG_LEVEL_ERROR',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9ace06c8008d88bf2a2a8f4986667e46ae',1,'cv::utils::logging']]], - ['log_5flevel_5ffatal_390',['LOG_LEVEL_FATAL',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9a575a4dbf4c097783849fbcca720e8a29',1,'cv::utils::logging']]], - ['log_5flevel_5finfo_391',['LOG_LEVEL_INFO',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9a385487d1e9fa9a1619d50c5c5b004feb',1,'cv::utils::logging']]], - ['log_5flevel_5fsilent_392',['LOG_LEVEL_SILENT',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9af22555055cb3ea3e5abe29d84714b7e6',1,'cv::utils::logging']]], - ['log_5flevel_5fverbose_393',['LOG_LEVEL_VERBOSE',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9acdc999c35e205d46f10ac7c15b3b011e',1,'cv::utils::logging']]], - ['log_5flevel_5fwarning_394',['LOG_LEVEL_WARNING',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9a4a4b8775ccf5e8c421aa7c457344b268',1,'cv::utils::logging']]], - ['log_5fwarp_5fsize_395',['LOG_WARP_SIZE',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gga2f3f6453629c910d4743da03f69e0519a2af7ce9904ce49d3a4b05a9b4c5c0d89',1,'cv::cudev::LOG_WARP_SIZE'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gga2f3f6453629c910d4743da03f69e0519a2af7ce9904ce49d3a4b05a9b4c5c0d89',1,'LOG_WARP_SIZE(Global Namespace)']]], - ['logabsdeterminant_396',['logAbsDeterminant',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#afdc29438a335871f67449c253369ce12',1,'Eigen::ColPivHouseholderQR::logAbsDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#afdc29438a335871f67449c253369ce12',1,'ColPivHouseholderQR< MatrixType >::logAbsDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ad59d6dc78dab52a0038ac372b4a72c0d',1,'Eigen::CompleteOrthogonalDecomposition::logAbsDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aafde38918912c9b562f44b0fc3b22589',1,'Eigen::FullPivHouseholderQR::logAbsDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#af61b6dbef34fc51c825182b16dc43ca1',1,'Eigen::HouseholderQR::logAbsDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a7548f80c5cdce49ddc6f994567a26eac',1,'Eigen::SparseLU::logAbsDeterminant()']]], - ['logarithm_20calculation_397',['Natural logarithm calculation',['https://docs.opencv.org/4.2.0/d2/de4/group__core__hal__interface__log.html',1,'']]], - ['logdeterminant_398',['logDeterminant',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a597f7839a39604af18a8741a0d8c46bf',1,'Eigen::CholmodBase::logDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a597f7839a39604af18a8741a0d8c46bf',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::logDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a597f7839a39604af18a8741a0d8c46bf',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::logDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a597f7839a39604af18a8741a0d8c46bf',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::logDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a597f7839a39604af18a8741a0d8c46bf',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::logDeterminant()']]], - ['logger_2edefines_2ehpp_399',['logger.defines.hpp',['https://docs.opencv.org/4.2.0/df/dc4/logger_8defines_8hpp.html',1,'']]], - ['logger_2eh_400',['logger.h',['https://docs.opencv.org/4.2.0/d1/d8c/logger_8h.html',1,'']]], - ['logger_2ehpp_401',['logger.hpp',['https://docs.opencv.org/4.2.0/d6/da3/logger_8hpp.html',1,'']]], - ['logging_20facilities_402',['Logging facilities',['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html',1,'']]], - ['logic_5ferror_403',['logic_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02791.html',1,'std::logic_error'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02791.html#a48e6f223bbd547dcea0d5efdb54b4951',1,'std::logic_error::logic_error()']]], - ['logical_20operations_404',['Bitwise logical operations',['https://docs.opencv.org/4.2.0/d2/d18/group__core__hal__interface__logical.html',1,'']]], - ['logical_5fand_405',['logical_and',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1cudev_1_1logical__and.html',1,'cv::cudev::logical_and< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07531.html',1,'std::logical_and< class >']]], - ['logical_5fand_3c_20void_20_3e_406',['logical_and< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07543.html',1,'std']]], - ['logical_5fnot_407',['logical_not',['https://docs.opencv.org/4.2.0/d4/d01/structcv_1_1cudev_1_1logical__not.html',1,'cv::cudev::logical_not< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07539.html',1,'std::logical_not< class >']]], - ['logical_5fnot_3c_20void_20_3e_408',['logical_not< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07551.html',1,'std']]], - ['logical_5for_409',['logical_or',['https://docs.opencv.org/4.2.0/d3/db2/structcv_1_1cudev_1_1logical__or.html',1,'cv::cudev::logical_or< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07535.html',1,'std::logical_or< class >']]], - ['logical_5for_3c_20void_20_3e_410',['logical_or< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07547.html',1,'std']]], - ['logistic_411',['logistic',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#adb0b668da3480346f2fc81f229b570a6',1,'Eigen']]], - ['logisticregression_412',['LogisticRegression',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html',1,'cv::ml']]], - ['logit_413',['LOGIT',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a22a5db4ceb750ca68782ddb32f44562fafe61aed9caa42c3cc53f3f6f7a09da48',1,'cv::ml::Boost']]], - ['loglevel_414',['LogLevel',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9',1,'cv::utils::logging']]], - ['lognormal_5fdistribution_415',['lognormal_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html',1,'std']]], - ['logpolar_416',['logPolar',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gaec3a0b126a85b5ca2c667b16e0ae022d',1,'cv::logPolar()'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gaec3a0b126a85b5ca2c667b16e0ae022d',1,'logPolar()(Global Namespace)']]], - ['logprocessingtime_417',['logProcessingTime',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aba0b47e6b1371d70beb659fff7f94fe8',1,'cv::videostab::StabilizerBase']]], - ['logsoftmax_418',['logSoftMax',['https://docs.opencv.org/4.2.0/d8/d18/classcv_1_1dnn_1_1SoftmaxLayer.html#aa55c1c0d83caf0946865e225ae37f664',1,'cv::dnn::SoftmaxLayer']]], - ['logstep_419',['logStep',['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a577e7820786e30214651d8a9702fd940',1,'cv::ml::ParamGrid']]], - ['logtag_420',['LogTag',['https://docs.opencv.org/4.2.0/d3/d18/structcv_1_1utils_1_1logging_1_1LogTag.html',1,'cv::utils::logging::LogTag'],['https://docs.opencv.org/4.2.0/d3/d18/structcv_1_1utils_1_1logging_1_1LogTag.html#ae33fa84c80ec7e207da5b15917324ff4',1,'cv::utils::logging::LogTag::LogTag()']]], - ['logtag_2ehpp_421',['logtag.hpp',['https://docs.opencv.org/4.2.0/d5/d77/logtag_8hpp.html',1,'']]], - ['logtagauto_422',['LogTagAuto',['https://docs.opencv.org/4.2.0/d1/df9/structcv_1_1utils_1_1logging_1_1LogTagAuto.html',1,'cv::utils::logging::LogTagAuto'],['https://docs.opencv.org/4.2.0/d1/df9/structcv_1_1utils_1_1logging_1_1LogTagAuto.html#a0254420565bc762a65b1cca8e4cea309',1,'cv::utils::logging::LogTagAuto::LogTagAuto()']]], - ['logtostdout_423',['LogToStdout',['https://docs.opencv.org/4.2.0/d5/de0/classcv_1_1videostab_1_1LogToStdout.html',1,'cv::videostab']]], - ['lon_424',['lon',['../structnavtypes_1_1gpscoords__t.html#aa9695449af42ffbd2732731ccf55644c',1,'navtypes::gpscoords_t']]], - ['lookup_425',['lookup',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#ac32a15d490b1a17dac63556b39d7535e',1,'cv::gapi::GKernelPackage']]], - ['lookup_20tables_20and_20time_20measurement_20with_20opencv_426',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], - ['lookup_5fclassname_427',['lookup_classname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ae475712d0d2b637992cfe799ea83d99c',1,'regex_traits< _CharType >::lookup_classname()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ae475712d0d2b637992cfe799ea83d99c',1,'std::regex_traits::lookup_classname()']]], - ['lookup_5fcollatename_428',['lookup_collatename',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ac1a97012352a2ccef114895cfb08307c',1,'regex_traits< _CharType >::lookup_collatename()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ac1a97012352a2ccef114895cfb08307c',1,'std::regex_traits::lookup_collatename()']]], - ['lookuptable_429',['LookUpTable',['https://docs.opencv.org/4.2.0/df/d29/classcv_1_1cuda_1_1LookUpTable.html',1,'cv::cuda']]], - ['losertree_2eh_430',['losertree.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00914.html',1,'']]], - ['lost_431',['lost',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a1b6022174f21e52d71e3049539bbf6b4',1,'cv::tbm::Track']]], - ['low_20level_20api_20for_20external_20libraries_20plugins_432',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], - ['lower_433',['Lower',['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cdaf581029282d421eee5aae14238c6f749',1,'Eigen::Lower'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cdaf581029282d421eee5aae14238c6f749',1,'Lower(Global Namespace)']]], - ['lower_5fbound_434',['lower_bound',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#adbb7e90f8d6bece7f9ffb6b76c9ab081',1,'std::map::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a5db81ee7912a625e5d7ead27f0cb4133',1,'std::map::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ab801bf5b252cc1b28af052263ce33d7a',1,'std::map::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a2dfc6f822052135a0b48e0dca314ccaf',1,'std::map::lower_bound(const _Kt &__x) const -> decltype(const_iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#adbb7e90f8d6bece7f9ffb6b76c9ab081',1,'std::map::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a5db81ee7912a625e5d7ead27f0cb4133',1,'std::map::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ab801bf5b252cc1b28af052263ce33d7a',1,'std::map::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a2dfc6f822052135a0b48e0dca314ccaf',1,'std::map::lower_bound(const _Kt &__x) const -> decltype(const_iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad74c803195d97566b7182ad94004068c',1,'std::multimap::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a046e9d0cdebf1e33b637b8d986b1d378',1,'std::multimap::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad125a9ac3189b3dffddd8cbf76e37387',1,'std::multimap::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2ffb43b298f209b70879d8aee8c31fec',1,'std::multimap::lower_bound(const _Kt &__x) const -> decltype(const_iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad74c803195d97566b7182ad94004068c',1,'std::multimap::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a046e9d0cdebf1e33b637b8d986b1d378',1,'std::multimap::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad125a9ac3189b3dffddd8cbf76e37387',1,'std::multimap::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2ffb43b298f209b70879d8aee8c31fec',1,'std::multimap::lower_bound(const _Kt &__x) const -> decltype(const_iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ac76a54ed49d2633b97a71e940461def3',1,'std::multiset::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aa1b1b9236aecf15614ac2f4659edd279',1,'std::multiset::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae1fcdebc244b6b7c006abcc3cb3c63d7',1,'std::multiset::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a9c254b02eb2bdec6f38b12170102b9fd',1,'std::multiset::lower_bound(const _Kt &__x) const -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ac76a54ed49d2633b97a71e940461def3',1,'std::multiset::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aa1b1b9236aecf15614ac2f4659edd279',1,'std::multiset::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae1fcdebc244b6b7c006abcc3cb3c63d7',1,'std::multiset::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a9c254b02eb2bdec6f38b12170102b9fd',1,'std::multiset::lower_bound(const _Kt &__x) const -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ae0623408c438fcbe7426deb496d3fd36',1,'std::set::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#abfcf2991ff3683e095dd11d089e7117c',1,'std::set::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a4ba764c0f23024700dfa99b600909b34',1,'std::set::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a91a143d5a364b10a3a13f6502ef0c23e',1,'std::set::lower_bound(const _Kt &__x) const -> decltype(const_iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ae0623408c438fcbe7426deb496d3fd36',1,'std::set::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#abfcf2991ff3683e095dd11d089e7117c',1,'std::set::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a4ba764c0f23024700dfa99b600909b34',1,'std::set::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a91a143d5a364b10a3a13f6502ef0c23e',1,'std::set::lower_bound(const _Kt &__x) const -> decltype(const_iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga6f1d41eed9a1fabbae1d54b384b07061',1,'std::lower_bound(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga80229c3a1e83296551a68c44bda48696',1,'std::lower_bound(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga6f1d41eed9a1fabbae1d54b384b07061',1,'lower_bound(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga80229c3a1e83296551a68c44bda48696',1,'lower_bound(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val, _Compare __comp)(Global Namespace)']]], - ['lowest_435',['lowest',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#aa2bb95f67b879e81fcc80383023eeeb7',1,'std::numeric_limits']]], - ['lpi_436',['lpi',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a45cf9fc1cbb09a4941cdb44fc608cb56',1,'cv::gapi::fluid::Buffer']]], - ['lpmotionstabilizer_437',['LpMotionStabilizer',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html',1,'cv::videostab::LpMotionStabilizer'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#aa24663cfdfb86dc3015f0292854f5f8b',1,'cv::videostab::LpMotionStabilizer::LpMotionStabilizer()']]], - ['lpnorm_438',['lpNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a72586ab059e889e7d2894ff227747e35',1,'Eigen::MatrixBase::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a72586ab059e889e7d2894ff227747e35',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a72586ab059e889e7d2894ff227747e35',1,'MatrixBase< Solve< Decomposition, RhsType > >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'Eigen::VectorwiseOp::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const Derived, Horizontal >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const Derived, Vertical >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::lpNorm()']]], - ['lpos_439',['lpos',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a56e2e4fcf08374696d6d99f6173f2081',1,'cv::MatConstIterator']]], - ['lrgb_5fto_5flab4_5f_440',['LRGB_to_Lab4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b6b794439a87c41b2e103e210a0caa4',1,'cv::cudev::LRGB_to_Lab4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b6b794439a87c41b2e103e210a0caa4',1,'LRGB_to_Lab4_()(Global Namespace)']]], - ['lrgb_5fto_5flab4_5ffunc_441',['LRGB_to_Lab4_func',['https://docs.opencv.org/4.2.0/db/d2b/structcv_1_1cudev_1_1LRGB__to__Lab4__func.html',1,'cv::cudev']]], - ['lrgb_5fto_5flab_5f_442',['LRGB_to_Lab_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc6bdde76e9184f83843d48dde22335e',1,'cv::cudev::LRGB_to_Lab_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc6bdde76e9184f83843d48dde22335e',1,'LRGB_to_Lab_()(Global Namespace)']]], - ['lrgb_5fto_5flab_5ffunc_443',['LRGB_to_Lab_func',['https://docs.opencv.org/4.2.0/d6/db7/structcv_1_1cudev_1_1LRGB__to__Lab__func.html',1,'cv::cudev']]], - ['lrgb_5fto_5fluv4_5f_444',['LRGB_to_Luv4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga692b3ec9e0f7ce8f3f7461aa9c794e22',1,'cv::cudev::LRGB_to_Luv4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga692b3ec9e0f7ce8f3f7461aa9c794e22',1,'LRGB_to_Luv4_()(Global Namespace)']]], - ['lrgb_5fto_5fluv4_5ffunc_445',['LRGB_to_Luv4_func',['https://docs.opencv.org/4.2.0/d7/dc8/structcv_1_1cudev_1_1LRGB__to__Luv4__func.html',1,'cv::cudev']]], - ['lrgb_5fto_5fluv_5f_446',['LRGB_to_Luv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30f34fd38b54d01ddb0648938547cd00',1,'cv::cudev::LRGB_to_Luv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30f34fd38b54d01ddb0648938547cd00',1,'LRGB_to_Luv_()(Global Namespace)']]], - ['lrgb_5fto_5fluv_5ffunc_447',['LRGB_to_Luv_func',['https://docs.opencv.org/4.2.0/d7/d62/structcv_1_1cudev_1_1LRGB__to__Luv__func.html',1,'cv::cudev']]], - ['lrgba_5fto_5flab4_5f_448',['LRGBA_to_Lab4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4de453e34af65b3b2b7b93c76f578f6',1,'cv::cudev::LRGBA_to_Lab4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4de453e34af65b3b2b7b93c76f578f6',1,'LRGBA_to_Lab4_()(Global Namespace)']]], - ['lrgba_5fto_5flab4_5ffunc_449',['LRGBA_to_Lab4_func',['https://docs.opencv.org/4.2.0/de/d7f/structcv_1_1cudev_1_1LRGBA__to__Lab4__func.html',1,'cv::cudev']]], - ['lrgba_5fto_5flab_5f_450',['LRGBA_to_Lab_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3864d44505667227680474b013de3500',1,'cv::cudev::LRGBA_to_Lab_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3864d44505667227680474b013de3500',1,'LRGBA_to_Lab_()(Global Namespace)']]], - ['lrgba_5fto_5flab_5ffunc_451',['LRGBA_to_Lab_func',['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1cudev_1_1LRGBA__to__Lab__func.html',1,'cv::cudev']]], - ['lrgba_5fto_5fluv4_5f_452',['LRGBA_to_Luv4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a03f510311fa9c0b4dc5c4a05788942',1,'cv::cudev::LRGBA_to_Luv4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a03f510311fa9c0b4dc5c4a05788942',1,'LRGBA_to_Luv4_()(Global Namespace)']]], - ['lrgba_5fto_5fluv4_5ffunc_453',['LRGBA_to_Luv4_func',['https://docs.opencv.org/4.2.0/dd/dea/structcv_1_1cudev_1_1LRGBA__to__Luv4__func.html',1,'cv::cudev']]], - ['lrgba_5fto_5fluv_5f_454',['LRGBA_to_Luv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a50c681001f8ce0aa0c884e06392a04',1,'cv::cudev::LRGBA_to_Luv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a50c681001f8ce0aa0c884e06392a04',1,'LRGBA_to_Luv_()(Global Namespace)']]], - ['lrgba_5fto_5fluv_5ffunc_455',['LRGBA_to_Luv_func',['https://docs.opencv.org/4.2.0/d2/d19/structcv_1_1cudev_1_1LRGBA__to__Luv__func.html',1,'cv::cudev']]], - ['lrnlayer_456',['LRNLayer',['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html',1,'cv::dnn']]], - ['lsbp_5fcamera_5fmotion_5fcompensation_5flk_457',['LSBP_CAMERA_MOTION_COMPENSATION_LK',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gga1a5838fa2d2697ac455b136bfcdb4600ad8f108b7815d6bcccd32b849063e0a9c',1,'cv::bgsegm::LSBP_CAMERA_MOTION_COMPENSATION_LK'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gga1a5838fa2d2697ac455b136bfcdb4600ad8f108b7815d6bcccd32b849063e0a9c',1,'LSBP_CAMERA_MOTION_COMPENSATION_LK(Global Namespace)']]], - ['lsbp_5fcamera_5fmotion_5fcompensation_5fnone_458',['LSBP_CAMERA_MOTION_COMPENSATION_NONE',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gga1a5838fa2d2697ac455b136bfcdb4600a5851b7a8bd9c7cec7006e8c619122f3c',1,'cv::bgsegm::LSBP_CAMERA_MOTION_COMPENSATION_NONE'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gga1a5838fa2d2697ac455b136bfcdb4600a5851b7a8bd9c7cec7006e8c619122f3c',1,'LSBP_CAMERA_MOTION_COMPENSATION_NONE(Global Namespace)']]], - ['lsbpcameramotioncompensation_459',['LSBPCameraMotionCompensation',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga1a5838fa2d2697ac455b136bfcdb4600',1,'cv::bgsegm::LSBPCameraMotionCompensation'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga1a5838fa2d2697ac455b136bfcdb4600',1,'LSBPCameraMotionCompensation(Global Namespace)']]], - ['lsc_2ehpp_460',['lsc.hpp',['https://docs.opencv.org/4.2.0/da/d29/lsc_8hpp.html',1,'']]], - ['lsd_5frefine_5fadv_461',['LSD_REFINE_ADV',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ggad092a7362b8afb8a905238a41898d98ca88d573b707a6f7bbdeae166247cd8c15',1,'cv::LSD_REFINE_ADV'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ggad092a7362b8afb8a905238a41898d98ca88d573b707a6f7bbdeae166247cd8c15',1,'LSD_REFINE_ADV(Global Namespace)']]], - ['lsd_5frefine_5fnone_462',['LSD_REFINE_NONE',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ggad092a7362b8afb8a905238a41898d98ca0114485ddcbb3d913b6d899a8697e30e',1,'cv::LSD_REFINE_NONE'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ggad092a7362b8afb8a905238a41898d98ca0114485ddcbb3d913b6d899a8697e30e',1,'LSD_REFINE_NONE(Global Namespace)']]], - ['lsd_5frefine_5fstd_463',['LSD_REFINE_STD',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ggad092a7362b8afb8a905238a41898d98cade4b0da3a52bc9765f08255f041facb4',1,'cv::LSD_REFINE_STD'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ggad092a7362b8afb8a905238a41898d98cade4b0da3a52bc9765f08255f041facb4',1,'LSD_REFINE_STD(Global Namespace)']]], - ['lsddetector_464',['LSDDetector',['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html',1,'cv::line_descriptor::LSDDetector'],['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#a2a4e6484d35ea1a16cd89cf06bab6aef',1,'cv::line_descriptor::LSDDetector::LSDDetector()'],['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#a4f10b3e3cddf8c4f9ed306af8f7f621f',1,'cv::line_descriptor::LSDDetector::LSDDetector(LSDParam _params)']]], - ['lsdparam_465',['LSDParam',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html',1,'cv::line_descriptor::LSDParam'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#ab9ed5e6e4d8b3d10a547e5c58d4a7545',1,'cv::line_descriptor::LSDParam::LSDParam()']]], - ['lsh_5findex_2eh_466',['lsh_index.h',['https://docs.opencv.org/4.2.0/dd/d79/lsh__index_8h.html',1,'']]], - ['lsh_5ftable_2eh_467',['lsh_table.h',['https://docs.opencv.org/4.2.0/d6/db3/lsh__table_8h.html',1,'']]], - ['lshift_468',['lshift',['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gafd072accecb14c9adccdad45e3bf2300',1,'cv::cuda::lshift()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gafd072accecb14c9adccdad45e3bf2300',1,'lshift()(Global Namespace)']]], - ['lstmlayer_469',['LSTMLayer',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html',1,'cv::dnn']]], - ['lt_470',['lt',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#a0c3534c983a8be0b4416c458a920aeec',1,'cv::gapi::wip::draw::Circle::lt'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#ae6a8f0ba84f674f9c3fdf87f3d2107f0',1,'cv::gapi::wip::draw::Line::lt'],['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#af0f7ecd2e8b4098625a193b9676b6bdd',1,'cv::gapi::wip::draw::Poly::lt'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html#ae10a93a9f5924b64fcca832b0c7ca04e',1,'cv::gapi::wip::draw::Rect::lt'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a688d93708a9c11ff5582b64484dcd334',1,'cv::gapi::wip::draw::Text::lt']]], - ['lu_471',['lu',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb312afbfe960cbda67811552d876fae',1,'Eigen::MatrixBase::lu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb312afbfe960cbda67811552d876fae',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::lu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb312afbfe960cbda67811552d876fae',1,'MatrixBase< Solve< Decomposition, RhsType > >::lu()']]], - ['lu_472',['LU',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6caa4b9c6213b619c6e6f7523dc520fb',1,'cv::LU(float *A, size_t astep, int m, float *b, size_t bstep, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf80b646047515ac185536d342f3219a5',1,'cv::LU(double *A, size_t astep, int m, double *b, size_t bstep, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6caa4b9c6213b619c6e6f7523dc520fb',1,'LU(float *A, size_t astep, int m, float *b, size_t bstep, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf80b646047515ac185536d342f3219a5',1,'LU(double *A, size_t astep, int m, double *b, size_t bstep, int n)(Global Namespace)']]], - ['lu_20matrix_20decomposition_473',['LU matrix decomposition',['https://docs.opencv.org/4.2.0/d5/d42/group__core__hal__interface__decomp__lu.html',1,'']]], - ['lu_20module_474',['LU module',['https://eigen.tuxfamily.org/dox/group__LU__Module.html',1,'']]], - ['lu32f_475',['LU32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfb1d2c42a8292dd0f9bb63abd2c0d41',1,'cv::hal::LU32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfb1d2c42a8292dd0f9bb63abd2c0d41',1,'LU32f()(Global Namespace)']]], - ['lu64f_476',['LU64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga96b03c679e27c7cf3ec17823db7b260d',1,'cv::hal::LU64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga96b03c679e27c7cf3ec17823db7b260d',1,'LU64f()(Global Namespace)']]], - ['lu_5fcounter_5fmetadata_477',['lu_counter_metadata',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11855.html',1,'__gnu_pbds::detail']]], - ['lu_5fcounter_5fmetadata_2ehpp_478',['lu_counter_metadata.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01361.html',1,'']]], - ['lu_5fcounter_5fpolicy_479',['lu_counter_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html',1,'__gnu_pbds']]], - ['lu_5fcounter_5fpolicy_5fbase_480',['lu_counter_policy_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11851.html',1,'__gnu_pbds::detail']]], - ['lu_5fcounter_5fpolicy_5fbase_3c_20_5falloc_3a_3asize_5ftype_20_3e_481',['lu_counter_policy_base< _Alloc::size_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11851.html',1,'']]], - ['lu_5fmap_482',['lu_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11827.html',1,'__gnu_pbds::detail']]], - ['lu_5fmap_5f_2ehpp_483',['lu_map_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01358.html',1,'']]], - ['lu_5fmove_5fto_5ffront_5fpolicy_484',['lu_move_to_front_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html',1,'__gnu_pbds']]], - ['lucid_485',['LUCID',['https://docs.opencv.org/4.2.0/d4/d86/classcv_1_1xfeatures2d_1_1LUCID.html',1,'cv::xfeatures2d']]], - ['lut_486',['LUT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab55b8d062b7f5587720ede032d34156f',1,'cv::LUT()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga7f13dbe65b7df6816c53162647762a11',1,'cv::gapi::LUT()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab55b8d062b7f5587720ede032d34156f',1,'LUT(InputArray src, InputArray lut, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga7f13dbe65b7df6816c53162647762a11',1,'LUT(const GMat &src, const Mat &lut)(Global Namespace)']]], - ['lut_2ehpp_487',['lut.hpp',['https://docs.opencv.org/4.2.0/d7/d32/lut_8hpp.html',1,'']]], - ['lut_5f_488',['lut_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a31ed286e5a9ec9e6a59e27eed4c85b',1,'cv::cudev::lut_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a31ed286e5a9ec9e6a59e27eed4c85b',1,'lut_()(Global Namespace)']]], - ['lutptr_489',['LutPtr',['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html',1,'cv::cudev']]], - ['lutptr_490',['lutPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd4c67c9f95732b8b985d6e9ff086c64',1,'cv::cudev::lutPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd4c67c9f95732b8b985d6e9ff086c64',1,'lutPtr()(Global Namespace)']]], - ['lutptrsz_491',['LutPtrSz',['https://docs.opencv.org/4.2.0/d5/d22/structcv_1_1cudev_1_1LutPtrSz.html',1,'cv::cudev']]], - ['luv2bgr_492',['LUV2BGR',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#gad83380f5b614aebd9430c09800e12849',1,'cv::gapi::LUV2BGR()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#gad83380f5b614aebd9430c09800e12849',1,'LUV2BGR()(Global Namespace)']]], - ['luv2rgb_493',['Luv2RGB',['https://docs.opencv.org/4.2.0/d6/d2a/classcv_1_1cudev_1_1color__cvt__detail_1_1Luv2RGB.html',1,'cv::cudev::color_cvt_detail']]], - ['luv4_5fto_5fbgr_5f_494',['Luv4_to_BGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf80fef715daf5b36e6ad49fcdbfa7c3d',1,'cv::cudev::Luv4_to_BGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf80fef715daf5b36e6ad49fcdbfa7c3d',1,'Luv4_to_BGR_()(Global Namespace)']]], - ['luv4_5fto_5fbgr_5ffunc_495',['Luv4_to_BGR_func',['https://docs.opencv.org/4.2.0/d5/d34/structcv_1_1cudev_1_1Luv4__to__BGR__func.html',1,'cv::cudev']]], - ['luv4_5fto_5fbgra_5f_496',['Luv4_to_BGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91f9613961b60293fb8eb404141edcb4',1,'cv::cudev::Luv4_to_BGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91f9613961b60293fb8eb404141edcb4',1,'Luv4_to_BGRA_()(Global Namespace)']]], - ['luv4_5fto_5fbgra_5ffunc_497',['Luv4_to_BGRA_func',['https://docs.opencv.org/4.2.0/d4/d0b/structcv_1_1cudev_1_1Luv4__to__BGRA__func.html',1,'cv::cudev']]], - ['luv4_5fto_5flbgr_5f_498',['Luv4_to_LBGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f9f5f45f121f25eb86134f913d0e6e',1,'cv::cudev::Luv4_to_LBGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f9f5f45f121f25eb86134f913d0e6e',1,'Luv4_to_LBGR_()(Global Namespace)']]], - ['luv4_5fto_5flbgr_5ffunc_499',['Luv4_to_LBGR_func',['https://docs.opencv.org/4.2.0/d6/d9a/structcv_1_1cudev_1_1Luv4__to__LBGR__func.html',1,'cv::cudev']]], - ['luv4_5fto_5flbgra_5f_500',['Luv4_to_LBGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8483aba33f1908ede7e55dcdccaa8a30',1,'cv::cudev::Luv4_to_LBGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8483aba33f1908ede7e55dcdccaa8a30',1,'Luv4_to_LBGRA_()(Global Namespace)']]], - ['luv4_5fto_5flbgra_5ffunc_501',['Luv4_to_LBGRA_func',['https://docs.opencv.org/4.2.0/df/d46/structcv_1_1cudev_1_1Luv4__to__LBGRA__func.html',1,'cv::cudev']]], - ['luv4_5fto_5flrgb_5f_502',['Luv4_to_LRGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf01d4bcca087a03a65d2ea3a4bbaeb0',1,'cv::cudev::Luv4_to_LRGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf01d4bcca087a03a65d2ea3a4bbaeb0',1,'Luv4_to_LRGB_()(Global Namespace)']]], - ['luv4_5fto_5flrgb_5ffunc_503',['Luv4_to_LRGB_func',['https://docs.opencv.org/4.2.0/d8/db0/structcv_1_1cudev_1_1Luv4__to__LRGB__func.html',1,'cv::cudev']]], - ['luv4_5fto_5flrgba_5f_504',['Luv4_to_LRGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c6e2c35503c364b883801bb953ba534',1,'cv::cudev::Luv4_to_LRGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c6e2c35503c364b883801bb953ba534',1,'Luv4_to_LRGBA_()(Global Namespace)']]], - ['luv4_5fto_5flrgba_5ffunc_505',['Luv4_to_LRGBA_func',['https://docs.opencv.org/4.2.0/d2/dc0/structcv_1_1cudev_1_1Luv4__to__LRGBA__func.html',1,'cv::cudev']]], - ['luv4_5fto_5frgb_5f_506',['Luv4_to_RGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga924358ec8a5e9d90292661d096549b19',1,'cv::cudev::Luv4_to_RGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga924358ec8a5e9d90292661d096549b19',1,'Luv4_to_RGB_()(Global Namespace)']]], - ['luv4_5fto_5frgb_5ffunc_507',['Luv4_to_RGB_func',['https://docs.opencv.org/4.2.0/de/d9f/structcv_1_1cudev_1_1Luv4__to__RGB__func.html',1,'cv::cudev']]], - ['luv4_5fto_5frgba_5f_508',['Luv4_to_RGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9081941871dce5ced62c38bbf05307c9',1,'cv::cudev::Luv4_to_RGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9081941871dce5ced62c38bbf05307c9',1,'Luv4_to_RGBA_()(Global Namespace)']]], - ['luv4_5fto_5frgba_5ffunc_509',['Luv4_to_RGBA_func',['https://docs.opencv.org/4.2.0/d2/dda/structcv_1_1cudev_1_1Luv4__to__RGBA__func.html',1,'cv::cudev']]], - ['luv_5fto_5fbgr_5f_510',['Luv_to_BGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8a0199c0b26adeb2d600778eba84190',1,'cv::cudev::Luv_to_BGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8a0199c0b26adeb2d600778eba84190',1,'Luv_to_BGR_()(Global Namespace)']]], - ['luv_5fto_5fbgr_5ffunc_511',['Luv_to_BGR_func',['https://docs.opencv.org/4.2.0/d2/da9/structcv_1_1cudev_1_1Luv__to__BGR__func.html',1,'cv::cudev']]], - ['luv_5fto_5fbgra_5f_512',['Luv_to_BGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga275c3ff3d8e27c8fc6fd7d1b40b52d75',1,'cv::cudev::Luv_to_BGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga275c3ff3d8e27c8fc6fd7d1b40b52d75',1,'Luv_to_BGRA_()(Global Namespace)']]], - ['luv_5fto_5fbgra_5ffunc_513',['Luv_to_BGRA_func',['https://docs.opencv.org/4.2.0/df/d49/structcv_1_1cudev_1_1Luv__to__BGRA__func.html',1,'cv::cudev']]], - ['luv_5fto_5flbgr_5f_514',['Luv_to_LBGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d4dec5e16d429550b7162afb1ceb18e',1,'cv::cudev::Luv_to_LBGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d4dec5e16d429550b7162afb1ceb18e',1,'Luv_to_LBGR_()(Global Namespace)']]], - ['luv_5fto_5flbgr_5ffunc_515',['Luv_to_LBGR_func',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1cudev_1_1Luv__to__LBGR__func.html',1,'cv::cudev']]], - ['luv_5fto_5flbgra_5f_516',['Luv_to_LBGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga655159f0bbf0a2d396aa3a862e4b9d5f',1,'cv::cudev::Luv_to_LBGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga655159f0bbf0a2d396aa3a862e4b9d5f',1,'Luv_to_LBGRA_()(Global Namespace)']]], - ['luv_5fto_5flbgra_5ffunc_517',['Luv_to_LBGRA_func',['https://docs.opencv.org/4.2.0/d0/da4/structcv_1_1cudev_1_1Luv__to__LBGRA__func.html',1,'cv::cudev']]], - ['luv_5fto_5flrgb_5f_518',['Luv_to_LRGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bd1e9fccd4732b0cacf5820be9e005c',1,'cv::cudev::Luv_to_LRGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bd1e9fccd4732b0cacf5820be9e005c',1,'Luv_to_LRGB_()(Global Namespace)']]], - ['luv_5fto_5flrgb_5ffunc_519',['Luv_to_LRGB_func',['https://docs.opencv.org/4.2.0/d7/d11/structcv_1_1cudev_1_1Luv__to__LRGB__func.html',1,'cv::cudev']]], - ['luv_5fto_5flrgba_5f_520',['Luv_to_LRGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6d1647bd0cb36dd68655af2486f7964',1,'cv::cudev::Luv_to_LRGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6d1647bd0cb36dd68655af2486f7964',1,'Luv_to_LRGBA_()(Global Namespace)']]], - ['luv_5fto_5flrgba_5ffunc_521',['Luv_to_LRGBA_func',['https://docs.opencv.org/4.2.0/d0/d32/structcv_1_1cudev_1_1Luv__to__LRGBA__func.html',1,'cv::cudev']]], - ['luv_5fto_5frgb_5f_522',['Luv_to_RGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga498d2783c4cca8d8ddb9b0d6936ab468',1,'cv::cudev::Luv_to_RGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga498d2783c4cca8d8ddb9b0d6936ab468',1,'Luv_to_RGB_()(Global Namespace)']]], - ['luv_5fto_5frgb_5ffunc_523',['Luv_to_RGB_func',['https://docs.opencv.org/4.2.0/d4/d45/structcv_1_1cudev_1_1Luv__to__RGB__func.html',1,'cv::cudev']]], - ['luv_5fto_5frgba_5f_524',['Luv_to_RGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a989abde2212a2d09bb6890f6ea2c78',1,'cv::cudev::Luv_to_RGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a989abde2212a2d09bb6890f6ea2c78',1,'Luv_to_RGBA_()(Global Namespace)']]], - ['luv_5fto_5frgba_5ffunc_525',['Luv_to_RGBA_func',['https://docs.opencv.org/4.2.0/d8/d1e/structcv_1_1cudev_1_1Luv__to__RGBA__func.html',1,'cv::cudev']]], - ['lvaluebit_526',['LvalueBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gae2c323957f20dfdc6cb8f44428eaec1a',1,'Eigen::LvalueBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gae2c323957f20dfdc6cb8f44428eaec1a',1,'LvalueBit(Global Namespace)']]] + ['ldlt_126',['LDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html',1,'Eigen::LDLT< class, _UpLo >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a2e06dedd2651649c5b251fbf9ba4e7d4',1,'Eigen::LDLT::LDLT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#ad0e8d2131ea1a626a08d98e9effb1cc5',1,'Eigen::LDLT::LDLT(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#adf853d6cbbc49f3535a44439bca344d9',1,'Eigen::LDLT::LDLT(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a154aa41bd2460199d48861eaf5e4f597',1,'Eigen::LDLT::LDLT(Index size)']]], + ['ldlt_127',['ldlt',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ecf058a0727a4cab8b42d79e95072e1',1,'Eigen::MatrixBase::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ecf058a0727a4cab8b42d79e95072e1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ecf058a0727a4cab8b42d79e95072e1',1,'MatrixBase< Solve< Decomposition, RhsType > >::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a644155eef17b37c95d85b9f65bb49ac4',1,'Eigen::SelfAdjointView::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a644155eef17b37c95d85b9f65bb49ac4',1,'SelfAdjointView< const Derived, UpLo >::ldlt()']]], + ['ldr_5fsize_128',['LDR_SIZE',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gga2a3c172d2347484dc6c32247aef4e90ba11377cb33f0a607d50cdc65e529529a1',1,'cv::LDR_SIZE'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gga2a3c172d2347484dc6c32247aef4e90ba11377cb33f0a607d50cdc65e529529a1',1,'LDR_SIZE(Global Namespace)']]], + ['leakyrelu_129',['LEAKYRELU',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ade71470ec8814021728f8b31b09773b0a193fdf7b38189212e1f7d2584c5ebaf6',1,'cv::ml::ANN_MLP']]], + ['learning_130',['Learning',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html',1,'Machine Learning'],['https://docs.opencv.org/4.2.0/d6/de2/tutorial_py_table_of_contents_ml.html',1,'Machine Learning']]], + ['learning_20based_20white_20balance_20algorithm_131',['Training the learning-based white balance algorithm',['https://docs.opencv.org/4.2.0/dc/dcb/tutorial_xphoto_training_white_balance.html',1,'']]], + ['learning_20layers_20support_132',['Custom deep learning layers support',['https://docs.opencv.org/4.2.0/dc/db1/tutorial_dnn_custom_layers.html',1,'']]], + ['learning_20ml_20module_133',['Machine Learning (ml module)',['https://docs.opencv.org/4.2.0/d1/d69/tutorial_table_of_content_ml.html',1,'']]], + ['learning_20overview_134',['Machine Learning Overview',['https://docs.opencv.org/4.2.0/dc/dd6/ml_intro.html',1,'']]], + ['learning_5frate_135',['learning_rate',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a2cc1c97c643620cf6386a6be2da711de',1,'cv::face::FacemarkKazemi::Params']]], + ['learningbasedwb_136',['LearningBasedWB',['https://docs.opencv.org/4.2.0/d4/d3b/classcv_1_1xphoto_1_1LearningBasedWB.html',1,'cv::xphoto']]], + ['least_20squares_20systems_137',['Solving linear least squares systems',['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'']]], + ['leastsquarediagonalpreconditioner_138',['LeastSquareDiagonalPreconditioner',['https://eigen.tuxfamily.org/dox/classEigen_1_1LeastSquareDiagonalPreconditioner.html',1,'Eigen']]], + ['leastsquaresconjugategradient_139',['LeastSquaresConjugateGradient',['https://eigen.tuxfamily.org/dox/classEigen_1_1LeastSquaresConjugateGradient.html',1,'Eigen::LeastSquaresConjugateGradient< class, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LeastSquaresConjugateGradient.html#ace69f423fcc1f8960d0e2de0667447c9',1,'Eigen::LeastSquaresConjugateGradient::LeastSquaresConjugateGradient()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LeastSquaresConjugateGradient.html#a91c4f2edc20f93cee9b721165937fb99',1,'Eigen::LeastSquaresConjugateGradient::LeastSquaresConjugateGradient(const EigenBase< MatrixDerived > &A)']]], + ['leavebiggestcomponent_140',['leaveBiggestComponent',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#ga855d2fccbcfc3b3477b34d415be5e786',1,'cv::detail::leaveBiggestComponent()'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#ga855d2fccbcfc3b3477b34d415be5e786',1,'leaveBiggestComponent()(Global Namespace)']]], + ['left_141',['LEFT',['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a69491a271644378beb97b78b33c96c8f',1,'cv::datasets::LEFT'],['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a69491a271644378beb97b78b33c96c8f',1,'LEFT(Global Namespace)']]], + ['left_142',['left',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#a8a20954e6e4a878fb0a58fc88eb07b89',1,'cv::optflow::GPCTree::Node::left'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#a26231cbf179cf990d4f3a813ffda2e3b',1,'cv::ml::DTrees::Node::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_ios< char, _Traits >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_iostream< char >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_istream< char >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_istream< char, _Traits >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_ostream< char >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_ostream< char, _Traits >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_fstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ifstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ios::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_iostream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_istream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_istringstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ofstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ostream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ostringstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_stringstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::ios_base::left'],['../structkinematics_1_1gearpos__t.html#ab9f24910ece227927746cb148af727f5',1,'kinematics::gearpos_t::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a96d1c2cab30f14f4e34ccb460f1ad1c9',1,'std::left()']]], + ['left_5fchild_5fnext_5fsibling_5fheap_143',['left_child_next_sibling_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11803.html',1,'__gnu_pbds::detail']]], + ['left_5fchild_5fnext_5fsibling_5fheap_3c_20value_5ftype_2c_20cmp_5ffn_2c_20_5falloc_3a_3asize_5ftype_2c_20_5falloc_20_3e_144',['left_child_next_sibling_heap< Value_Type, Cmp_Fn, _Alloc::size_type, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11803.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_3c_20value_5ftype_2c_20cmp_5ffn_2c_20null_5ftype_2c_20_5falloc_20_3e_145',['left_child_next_sibling_heap< Value_Type, Cmp_Fn, null_type, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11803.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5f_2ehpp_146',['left_child_next_sibling_heap_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01349.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fconst_5fiterator_2ehpp_147',['left_child_next_sibling_heap_/const_iterator.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16655.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_148',['left_child_next_sibling_heap_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16694.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fdebug_5ffn_5fimps_2ehpp_149',['left_child_next_sibling_heap_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16763.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5f_2ferase_5ffn_5fimps_2ehpp_150',['left_child_next_sibling_heap_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16826.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5f_2finfo_5ffn_5fimps_2ehpp_151',['left_child_next_sibling_heap_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16961.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5f_2finsert_5ffn_5fimps_2ehpp_152',['left_child_next_sibling_heap_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16994.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fiterators_5ffn_5fimps_2ehpp_153',['left_child_next_sibling_heap_/iterators_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17045.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fnode_2ehpp_154',['left_child_next_sibling_heap_/node.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17099.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fpoint_5fconst_5fiterator_2ehpp_155',['left_child_next_sibling_heap_/point_const_iterator.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17138.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5f_2fpolicy_5faccess_5ffn_5fimps_2ehpp_156',['left_child_next_sibling_heap_/policy_access_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17156.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5f_2ftrace_5ffn_5fimps_2ehpp_157',['left_child_next_sibling_heap_/trace_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17291.html',1,'']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5fconst_5fiterator_5f_158',['left_child_next_sibling_heap_const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#a6d0bc89961b0ee4562057769c0b6d65d',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::left_child_next_sibling_heap_const_iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#ad84cc711e4b85e7e3cd6a56bf0e123fb',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::left_child_next_sibling_heap_const_iterator_(const left_child_next_sibling_heap_const_iterator_< Node, _Alloc > &other)']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5fnode_5f_159',['left_child_next_sibling_heap_node_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11807.html',1,'__gnu_pbds::detail']]], + ['left_5fchild_5fnext_5fsibling_5fheap_5fnode_5fpoint_5fconst_5fiterator_5f_160',['left_child_next_sibling_heap_node_point_const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a2b5ec53c4fd8841483c95d86548cea47',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::left_child_next_sibling_heap_node_point_const_iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a4e9379a36eba962914ad7afe36fd5a98',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::left_child_next_sibling_heap_node_point_const_iterator_(const left_child_next_sibling_heap_node_point_const_iterator_< Node, _Alloc > &other)']]], + ['leftbutton_161',['LeftButton',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#ada240f2528500ad1615e76fb2fd9e2baad19e455b33545d34f237e9f44c8bbd68',1,'cv::viz::MouseEvent']]], + ['legacy_20support_162',['Legacy support',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html',1,'']]], + ['legendre_163',['legendre',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf6eac7fcb98e25b8f3f7d1b95fa7add8',1,'std::legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gafbabf25c3e530e0b94b5e6a3aaab6b5a',1,'std::tr1::legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf6eac7fcb98e25b8f3f7d1b95fa7add8',1,'legendre(unsigned int __l, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gafbabf25c3e530e0b94b5e6a3aaab6b5a',1,'legendre(unsigned int __n, _Tp __x)(Global Namespace)']]], + ['legendref_164',['legendref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaed94e3c664c99f5204da75be75aeac21',1,'std::legendref()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaed94e3c664c99f5204da75be75aeac21',1,'legendref()(Global Namespace)']]], + ['legendrel_165',['legendrel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1b39bc22e3cc4860d08eb54099460391',1,'std::legendrel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1b39bc22e3cc4860d08eb54099460391',1,'legendrel()(Global Namespace)']]], + ['length_166',['length',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#aa226ee4c0ef7a7c622d77247fa82ac6f',1,'cv::tbm::Track::length'],['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a8ec652b7680740bbd0a0109bfb850e52',1,'cv::gapi::fluid::Buffer::length()'],['https://docs.opencv.org/4.2.0/dc/d73/classNCVVector.html#a5baef75e5a70683f42f86669b92da2a0',1,'NCVVector::length()'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#affc98774183eb6e5874f971d19f21961',1,'cv::gapi::fluid::View::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9409606a0963903c52cc2cb72f21fb27',1,'__gnu_cxx::__versa_string::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'__gnu_debug::basic_string::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< _CharT >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< _CharT, _Traits, _Allocator >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< char >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< char, char_traits< char >, _Byte_alloc >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< char_type, _Traits, _Alloc >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'basic_string< value_type >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4d5afaf65af6a5038ad666a6b4ac3836',1,'match_results< _Bi_iter >::length(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4d5afaf65af6a5038ad666a6b4ac3836',1,'match_results< _Bi_iter >::length(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a2d1679803ff038b130a3ac2d545da164',1,'regex_traits< _CharType >::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5963813a61b3dbc4edd03cf1f91608b5',1,'std::basic_string::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4d5afaf65af6a5038ad666a6b4ac3836',1,'std::match_results::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a2d1679803ff038b130a3ac2d545da164',1,'std::regex_traits::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#a553c0f19fbcb8bb670b0f26799a053ea',1,'std::sub_match::length()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#a553c0f19fbcb8bb670b0f26799a053ea',1,'sub_match< _Bi_iter >::length()']]], + ['length_20encoded_20image_167',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], + ['length_5ferror_168',['length_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02803.html',1,'std']]], + ['less_169',['less',['https://docs.opencv.org/4.2.0/d0/d04/structcv_1_1cudev_1_1less.html',1,'cv::cudev::less< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07415.html',1,'std::less< _Tp >']]], + ['less_3c_20void_20_3e_170',['less< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07471.html',1,'std']]], + ['less_5fequal_171',['less_equal',['https://docs.opencv.org/4.2.0/d1/d03/structcv_1_1cudev_1_1less__equal.html',1,'cv::cudev::less_equal< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07423.html',1,'std::less_equal< class >']]], + ['less_5fequal_3c_20void_20_3e_172',['less_equal< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07511.html',1,'std']]], + ['level_173',['level',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#aa7e9fa13d1173ba688b3550f959be364',1,'cv::text::ERStat::level'],['https://docs.opencv.org/4.2.0/d3/d18/structcv_1_1utils_1_1logging_1_1LogTag.html#ab2f82b2f9e4ed222078e35dfc3bfebe4',1,'cv::utils::logging::LogTag::level']]], + ['level_20api_20for_20external_20libraries_20plugins_174',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], + ['level_20design_20overview_175',['High-level design overview',['https://docs.opencv.org/4.2.0/de/d4d/gapi_hld.html',1,'']]], + ['level_20format_176',['Top-Level Format',['../cameraconfig.html#toplevel',1,'']]], + ['level_20gui_177',['High-level GUI',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html',1,'']]], + ['level_20gui_20and_20media_20highgui_20module_178',['High Level GUI and Media (highgui module)',['https://docs.opencv.org/4.2.0/d0/de2/tutorial_table_of_content_highgui.html',1,'']]], + ['level_20stitching_20api_20stitcher_20class_179',['High level stitching API (Stitcher class)',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'']]], + ['lex_180',['lex',['https://docs.opencv.org/4.2.0/d3/dc5/structcv_1_1datasets_1_1TR__svtObj.html#acbdbda9e155a7b67d77f715f786b5bb0',1,'cv::datasets::TR_svtObj']]], + ['lex100_181',['lex100',['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1datasets_1_1TR__icdarObj.html#afe4ea0f002c92e2552158ac5fa15b7ac',1,'cv::datasets::TR_icdarObj']]], + ['lexfull_182',['lexFull',['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1datasets_1_1TR__icdarObj.html#a4900b546a13391639c33024d437f2bd0',1,'cv::datasets::TR_icdarObj']]], + ['lexicographical_5fcompare_183',['lexicographical_compare',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga869d1fd6bb4929ef491edbfdbcc9f7b9',1,'std::lexicographical_compare(_II1 __first1, _II1 __last1, _II2 __first2, _II2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gae179ce2d015dc0908973644687dce4c6',1,'std::lexicographical_compare(_II1 __first1, _II1 __last1, _II2 __first2, _II2 __last2, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga869d1fd6bb4929ef491edbfdbcc9f7b9',1,'lexicographical_compare(_II1 __first1, _II1 __last1, _II2 __first2, _II2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gae179ce2d015dc0908973644687dce4c6',1,'lexicographical_compare(_II1 __first1, _II1 __last1, _II2 __first2, _II2 __last2, _Compare __comp)(Global Namespace)']]], + ['lexicographical_5fcompare_5f3way_184',['lexicographical_compare_3way',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gadd7eb026c10d4a6929b8c61d0501bdee',1,'__gnu_cxx::lexicographical_compare_3way()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gadd7eb026c10d4a6929b8c61d0501bdee',1,'lexicographical_compare_3way(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)(Global Namespace)']]], + ['lfts_5fconfig_2eh_185',['lfts_config.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01001.html',1,'']]], + ['lgamma_186',['lgamma',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ac2e6331628bb1989b7be6d7e42827649',1,'Eigen']]], + ['lhs_187',['lhs',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseBinaryOp.html#a33b8ee8eda1d963591b80ec07525f918',1,'Eigen::CwiseBinaryOp']]], + ['libmv_5fcameraintrinsicsoptions_188',['libmv_CameraIntrinsicsOptions',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html',1,'cv::sfm::libmv_CameraIntrinsicsOptions'],['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#afdc199c0b44e2ad43f581277020494b7',1,'cv::sfm::libmv_CameraIntrinsicsOptions::libmv_CameraIntrinsicsOptions()']]], + ['libmv_5freconstructionoptions_189',['libmv_ReconstructionOptions',['https://docs.opencv.org/4.2.0/d1/d61/classcv_1_1sfm_1_1libmv__ReconstructionOptions.html',1,'cv::sfm::libmv_ReconstructionOptions'],['https://docs.opencv.org/4.2.0/d1/d61/classcv_1_1sfm_1_1libmv__ReconstructionOptions.html#a4a4d4ad0f4413f7947982699f2a1a78b',1,'cv::sfm::libmv_ReconstructionOptions::libmv_ReconstructionOptions()']]], + ['libraries_20plugins_190',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], + ['light_191',['light',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ggaa38573e5a0fc4bf3706c054bf78abe32ad270947696ed1ad9ec4e9dd2ace1a024',1,'cv::datasets::light'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ggaa38573e5a0fc4bf3706c054bf78abe32ad270947696ed1ad9ec4e9dd2ace1a024',1,'light(Global Namespace)']]], + ['light_20api_192',['Structured Light API',['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html',1,'']]], + ['light_20tutorials_193',['Structured Light tutorials',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_structured_light.html',1,'']]], + ['lighting_194',['LIGHTING',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca1cf60cd6e7bb2919685ba047588085f3',1,'cv::viz::LIGHTING'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca1cf60cd6e7bb2919685ba047588085f3',1,'LIGHTING(Global Namespace)']]], + ['lightpose_195',['lightPose',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a1f03bce2a2f7acd1de7c9a886ca95570',1,'cv::dynafu::Params::lightPose'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a0b1c583ce09e20fbbcd138300ab4b05d',1,'cv::kinfu::Params::lightPose']]], + ['lime_196',['lime',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a990019705b2219eaa478612846714622',1,'cv::viz::Color']]], + ['limit_5fadjustor_197',['limit_adjustor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10703.html',1,'__gnu_cxx::limit_condition']]], + ['limit_5fcondition_198',['limit_condition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10687.html',1,'__gnu_cxx']]], + ['limits_199',['limits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00095.html',1,'']]], + ['limits_2ehpp_200',['limits.hpp',['https://docs.opencv.org/4.2.0/d7/d42/modules_2core_2include_2opencv2_2core_2cuda_2limits_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d46/contrib_2modules_2cudev_2include_2opencv2_2cudev_2util_2limits_8hpp.html',1,'(Global Namespace)']]], + ['limitswitchdata_201',['LimitSwitchData',['../classrobot_1_1types_1_1LimitSwitchData.html',1,'robot::types::LimitSwitchData'],['../classrobot_1_1types_1_1LimitSwitchData.html#a1fd3d2cee4b3b5ea416d651b9255ba24',1,'robot::types::LimitSwitchData::LimitSwitchData()']]], + ['limitswitchhigh_202',['limitSwitchHigh',['../structrobot_1_1encparams__t.html#a0c643c14682b7da130b53098e1902bab',1,'robot::encparams_t']]], + ['limitswitchlow_203',['limitSwitchLow',['../structrobot_1_1encparams__t.html#ae86fcd25014e6c1738d55e85a0989cbd',1,'robot::encparams_t']]], + ['line_204',['Line',['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html',1,'cv::gapi::wip::draw::Line'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#aba7af35a1455413aca6c5e1556de6ae7',1,'cv::gapi::wip::draw::Line::Line()']]], + ['line_205',['line',['https://docs.opencv.org/4.2.0/d4/dd9/structcvv_1_1impl_1_1CallMetaData.html#a3d28262421ad0e7426f63f7b6ab2c893',1,'cvv::impl::CallMetaData::line'],['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#aa81481ded6391d046768d9829c56fd90',1,'cv::Exception::line'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga7078a9fae8c7e7d13d24dac2520ae4a2',1,'cv::line()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga7078a9fae8c7e7d13d24dac2520ae4a2',1,'line(InputOutputArray img, Point pt1, Point pt2, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)']]], + ['line_20detector_206',['Fast line detector',['https://docs.opencv.org/4.2.0/df/ded/group__ximgproc__fast__line__detector.html',1,'']]], + ['line_20features_20tutorial_207',['Line Features Tutorial',['https://docs.opencv.org/4.2.0/df/dfa/tutorial_line_descriptor_main.html',1,'']]], + ['line_20transform_208',['Line Transform',['https://docs.opencv.org/4.2.0/d9/db0/tutorial_hough_lines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d6/d10/tutorial_py_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d3/de6/tutorial_js_houghlines.html',1,'Hough Line Transform']]], + ['line_5f4_209',['LINE_4',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a784ee59ec27d8bc88acddfb89c22f185',1,'cv::LINE_4'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a784ee59ec27d8bc88acddfb89c22f185',1,'LINE_4(Global Namespace)']]], + ['line_5f8_210',['LINE_8',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a5d32eda7017db273a37f158e5b51442a',1,'cv::LINE_8'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a5d32eda7017db273a37f158e5b51442a',1,'LINE_8(Global Namespace)']]], + ['line_5faa_211',['LINE_AA',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a85fdabe5335c9e6656563dfd7c94fb4f',1,'cv::LINE_AA'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a85fdabe5335c9e6656563dfd7c94fb4f',1,'LINE_AA(Global Namespace)']]], + ['line_5fdescriptor_2ehpp_212',['line_descriptor.hpp',['https://docs.opencv.org/4.2.0/df/d4a/line__descriptor_8hpp.html',1,'']]], + ['line_5floop_213',['LINE_LOOP',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabaf4d36edb6cf9011af8cf4015b5a61952',1,'cv::ogl::LINE_LOOP'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabaf4d36edb6cf9011af8cf4015b5a61952',1,'LINE_LOOP(Global Namespace)']]], + ['line_5fstrip_214',['LINE_STRIP',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba7aa95cc95670cd6bb875d0092e3bf457',1,'cv::ogl::LINE_STRIP'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba7aa95cc95670cd6bb875d0092e3bf457',1,'LINE_STRIP(Global Namespace)']]], + ['line_5ftype_215',['line_type',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a128c7f4c9bb3a29aabace35d44ad4004',1,'cv::QtFont']]], + ['line_5fwidth_216',['LINE_WIDTH',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca06fc87e04c15fbfad2977314751a8738',1,'cv::viz::LINE_WIDTH'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca06fc87e04c15fbfad2977314751a8738',1,'LINE_WIDTH(Global Namespace)']]], + ['linear_217',['LINEAR',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56ab92a19ab0c193735c3fd71f938dd87e7',1,'cv::ml::SVM::LINEAR'],['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#ggaf0af0db4c870be3ef86132870821d452a4d3d0c977941e929e23e9c6cb4ae4715',1,'cv::ft::LINEAR'],['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#ggaf0af0db4c870be3ef86132870821d452a4d3d0c977941e929e23e9c6cb4ae4715',1,'LINEAR(Global Namespace)']]], + ['linear_218',['linear',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#aba3b127ac7c7bd3d99d533a59f22242a',1,'cv::Affine3::linear(const Mat3 &L)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a914f41895b8a246232db4a186b70d480',1,'cv::Affine3::linear() const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#aba3b127ac7c7bd3d99d533a59f22242a',1,'Affine3< float >::linear(const Mat3 &L)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a914f41895b8a246232db4a186b70d480',1,'Affine3< float >::linear() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ad36538ee2c2970722eff343ee1bbfc7c',1,'Eigen::Transform::linear()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#af8c38249632146453785add778dc1081',1,'Eigen::Transform::linear() const']]], + ['linear_20algebra_219',['Sparse linear algebra',['https://eigen.tuxfamily.org/dox/group__Sparse__chapter.html',1,'']]], + ['linear_20algebra_20and_20decompositions_220',['Linear algebra and decompositions',['https://eigen.tuxfamily.org/dox/group__TutorialLinearAlgebra.html',1,'']]], + ['linear_20filters_221',['Making your own linear filters!',['https://docs.opencv.org/4.2.0/d4/dbd/tutorial_filter_2d.html',1,'']]], + ['linear_20least_20squares_20systems_222',['Solving linear least squares systems',['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'']]], + ['linear_20problems_20and_20decompositions_223',['Dense linear problems and decompositions',['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'']]], + ['linear_20systems_224',['Solving Sparse Linear Systems',['https://eigen.tuxfamily.org/dox/group__TopicSparseSystems.html',1,'']]], + ['linear_5fcongruential_5fengine_225',['linear_congruential_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html',1,'std::linear_congruential_engine< _UIntType, __a, __c, __m >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a8444b5d92cc748637faad0a99a74b465',1,'std::linear_congruential_engine::linear_congruential_engine()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a369efa188a734025bb65bf6fcec77cf3',1,'std::linear_congruential_engine::linear_congruential_engine(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a3e49cb7b04e60dfae94dd28844521da4',1,'std::linear_congruential_engine::linear_congruential_engine(_Sseq &__q)']]], + ['linear_5findex_2eh_226',['linear_index.h',['https://docs.opencv.org/4.2.0/dd/d0d/linear__index_8h.html',1,'']]], + ['linear_5fprobe_5ffn_227',['linear_probe_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11143.html',1,'__gnu_pbds']]], + ['linear_5fprobe_5ffn_5fimp_2ehpp_228',['linear_probe_fn_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01316.html',1,'']]], + ['linearaccessbit_229',['LinearAccessBit',['https://eigen.tuxfamily.org/dox/group__flags.html#ga4b983a15d57cd55806df618ac544d09e',1,'Eigen::LinearAccessBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#ga4b983a15d57cd55806df618ac544d09e',1,'LinearAccessBit(Global Namespace)']]], + ['linearinterptr_230',['LinearInterPtr',['https://docs.opencv.org/4.2.0/d7/d8a/structcv_1_1cudev_1_1LinearInterPtr.html',1,'cv::cudev']]], + ['linearinterptrsz_231',['LinearInterPtrSz',['https://docs.opencv.org/4.2.0/d9/d2e/structcv_1_1cudev_1_1LinearInterPtrSz.html',1,'cv::cudev']]], + ['linearly_20separable_20data_232',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], + ['linearmatrixtype_233',['LinearMatrixType',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a48138c0370e55371b95946c90d69e25c',1,'Eigen::Transform::LinearMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#ac5aca3bc67564e96ad550aba971de8b6',1,'Eigen::Translation::LinearMatrixType']]], + ['linearmemories_234',['LinearMemories',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#adb0b556a1308ff2bb81ad81e74e06a65',1,'cv::linemod::Detector']]], + ['linearmemorypyramid_235',['LinearMemoryPyramid',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a4063f79d0d03ee9652ca92abfe0cb950',1,'cv::linemod::Detector']]], + ['linearpart_236',['LinearPart',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a2195bd42561e691a8f6e7d989e77f328',1,'Eigen::Transform']]], + ['linearpolar_237',['linearPolar',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gaa38a6884ac8b6e0b9bed47939b5362f3',1,'cv::linearPolar()'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gaa38a6884ac8b6e0b9bed47939b5362f3',1,'linearPolar()(Global Namespace)']]], + ['lineiterator_238',['LineIterator',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html',1,'cv::LineIterator'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#ac83a4c574ce6a50a78a52d7eee10371b',1,'cv::LineIterator::LineIterator()']]], + ['linelength_239',['lineLength',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a7a1b7b2712a9c77d64d749729bdb79c2',1,'cv::line_descriptor::KeyLine']]], + ['linemod_2ehpp_240',['linemod.hpp',['https://docs.opencv.org/4.2.0/d7/d7a/linemod_8hpp.html',1,'']]], + ['lineptr_241',['linePtr',['https://docs.opencv.org/4.2.0/da/da5/structcv_1_1gapi_1_1fluid_1_1View_1_1Cache.html#aece02a10ae9f35a53dc89e57db2ab595',1,'cv::gapi::fluid::View::Cache']]], + ['lines_242',['LINES',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8ea1de81114c3db43c9dfa96870367a0',1,'cv::ogl::LINES'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8ea1de81114c3db43c9dfa96870367a0',1,'LINES(Global Namespace)']]], + ['lines_20by_20using_20morphological_20operations_243',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], + ['lines_20extracted_20from_20an_20image_244',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], + ['linesegmentdetector_245',['LineSegmentDetector',['https://docs.opencv.org/4.2.0/db/d73/classcv_1_1LineSegmentDetector.html',1,'cv']]], + ['linesegmentdetectormodes_246',['LineSegmentDetectorModes',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gad092a7362b8afb8a905238a41898d98c',1,'cv::LineSegmentDetectorModes'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gad092a7362b8afb8a905238a41898d98c',1,'LineSegmentDetectorModes(Global Namespace)']]], + ['linesready_247',['linesReady',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a502e0fa925af5cb42da841bc602ec942',1,'cv::gapi::fluid::Buffer']]], + ['linetypes_248',['LineTypes',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaf076ef45de481ac96e0ab3dc2c29a777',1,'cv::LineTypes'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaf076ef45de481ac96e0ab3dc2c29a777',1,'LineTypes(Global Namespace)']]], + ['linkeravailable_249',['linkerAvailable',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2a05649820a826afdb7d627f1b9cf408',1,'cv::ocl::Device']]], + ['linspaced_250',['LinSpaced',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ad8098aa5971139a5585e623dddbea860',1,'Eigen::DenseBase::LinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aaef589c1dbd7fad93f97bd3fa1b1e768',1,'Eigen::DenseBase::LinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2585c4a3458485a30a97afed81d85a92',1,'Eigen::DenseBase::LinSpaced(Sequential_t, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae08ebe5f98339ce1410fef9ba34e5918',1,'Eigen::DenseBase::LinSpaced(Sequential_t, Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ad8098aa5971139a5585e623dddbea860',1,'DenseBase< ArrayWrapper< ExpressionType > >::LinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aaef589c1dbd7fad93f97bd3fa1b1e768',1,'DenseBase< ArrayWrapper< ExpressionType > >::LinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2585c4a3458485a30a97afed81d85a92',1,'DenseBase< ArrayWrapper< ExpressionType > >::LinSpaced(Sequential_t, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae08ebe5f98339ce1410fef9ba34e5918',1,'DenseBase< ArrayWrapper< ExpressionType > >::LinSpaced(Sequential_t, Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ad8098aa5971139a5585e623dddbea860',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::LinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aaef589c1dbd7fad93f97bd3fa1b1e768',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::LinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2585c4a3458485a30a97afed81d85a92',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::LinSpaced(Sequential_t, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae08ebe5f98339ce1410fef9ba34e5918',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::LinSpaced(Sequential_t, Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ad8098aa5971139a5585e623dddbea860',1,'DenseBase< Solve< Decomposition, RhsType > >::LinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aaef589c1dbd7fad93f97bd3fa1b1e768',1,'DenseBase< Solve< Decomposition, RhsType > >::LinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2585c4a3458485a30a97afed81d85a92',1,'DenseBase< Solve< Decomposition, RhsType > >::LinSpaced(Sequential_t, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae08ebe5f98339ce1410fef9ba34e5918',1,'DenseBase< Solve< Decomposition, RhsType > >::LinSpaced(Sequential_t, Index size, const Scalar &low, const Scalar &high)']]], + ['linux_251',['Installation in Linux',['https://docs.opencv.org/4.2.0/d7/d9f/tutorial_linux_install.html',1,'']]], + ['linux_20systems_252',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]], + ['linux_5feclipse_2emarkdown_253',['linux_eclipse.markdown',['https://docs.opencv.org/4.2.0/da/d37/linux__eclipse_8markdown.html',1,'']]], + ['linux_5fgcc_5fcmake_2emarkdown_254',['linux_gcc_cmake.markdown',['https://docs.opencv.org/4.2.0/df/dc3/linux__gcc__cmake_8markdown.html',1,'']]], + ['linux_5finstall_2emarkdown_255',['linux_install.markdown',['https://docs.opencv.org/4.2.0/d7/d12/linux__install_8markdown.html',1,'']]], + ['list_256',['list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08863.html',1,'std::__debug::list< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09119.html',1,'std::__profile::list< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html',1,'std::list< _Tp, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00098.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8bd45a3517b01002de6debdb401d9170',1,'list< __inp, __rebind_inp >::list()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b6d1424066dbfd18daebac90d143837',1,'list< __inp, __rebind_inp >::list(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3f6568813bbdefbd94cbde64e3e45366',1,'list< __inp, __rebind_inp >::list(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac739777416320440d35c6de1a42ba818',1,'list< __inp, __rebind_inp >::list(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aec4657b924fb0c29b7d3e347a2da97f0',1,'list< __inp, __rebind_inp >::list(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a138af8bc9ad16e2d9f1f51057b50a786',1,'list< __inp, __rebind_inp >::list(list &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#abc914a91c0740ca3f52168d0b631dbf8',1,'list< __inp, __rebind_inp >::list(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad905b1f7f844c8715c654439611804a1',1,'list< __inp, __rebind_inp >::list(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8bd45a3517b01002de6debdb401d9170',1,'std::list::list()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b6d1424066dbfd18daebac90d143837',1,'std::list::list(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3f6568813bbdefbd94cbde64e3e45366',1,'std::list::list(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac739777416320440d35c6de1a42ba818',1,'std::list::list(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aec4657b924fb0c29b7d3e347a2da97f0',1,'std::list::list(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a138af8bc9ad16e2d9f1f51057b50a786',1,'std::list::list(list &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#abc914a91c0740ca3f52168d0b631dbf8',1,'std::list::list(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad905b1f7f844c8715c654439611804a1',1,'std::list::list(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())']]], + ['list_20based_257',['List-Based',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01532.html',1,'']]], + ['list_20of_20implemented_20layers_258',['Partial List of Implemented Layers',['https://docs.opencv.org/4.2.0/d6/d87/group__dnnLayerList.html',1,'']]], + ['list_2etcc_259',['list.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00392.html',1,'']]], + ['list_3c_20_5f_5finp_2c_20_5f_5frebind_5finp_20_3e_260',['list< __inp, __rebind_inp >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html',1,'']]], + ['list_3c_20t_20_3e_261',['list< T >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html',1,'std']]], + ['list_5fpartition_262',['list_partition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ad3be0fcbf87a1f43b3ecd406841e7b0d',1,'__gnu_parallel']]], + ['list_5fpartition_2eh_263',['list_partition.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00911.html',1,'']]], + ['list_5fupdate_264',['list_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11123.html',1,'__gnu_pbds::list_update< class, class, class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11123.html#a9d7daaa0c1b890842f1117e4be17366d',1,'__gnu_pbds::list_update::list_update()']]], + ['list_5fupdate_5fmap_5f_2fconstructor_5fdestructor_5ffn_5fimps_2ehpp_265',['list_update_map_/constructor_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16667.html',1,'']]], + ['list_5fupdate_5fmap_5f_2fdebug_5ffn_5fimps_2ehpp_266',['list_update_map_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16766.html',1,'']]], + ['list_5fupdate_5fmap_5f_2ferase_5ffn_5fimps_2ehpp_267',['list_update_map_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16829.html',1,'']]], + ['list_5fupdate_5fmap_5f_2ffind_5ffn_5fimps_2ehpp_268',['list_update_map_/find_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16880.html',1,'']]], + ['list_5fupdate_5fmap_5f_2finfo_5ffn_5fimps_2ehpp_269',['list_update_map_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16964.html',1,'']]], + ['list_5fupdate_5fmap_5f_2finsert_5ffn_5fimps_2ehpp_270',['list_update_map_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16997.html',1,'']]], + ['list_5fupdate_5fmap_5f_2fiterators_5ffn_5fimps_2ehpp_271',['list_update_map_/iterators_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17048.html',1,'']]], + ['list_5fupdate_5fmap_5f_2ftrace_5ffn_5fimps_2ehpp_272',['list_update_map_/trace_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17294.html',1,'']]], + ['list_5fupdate_5fpolicy_2ehpp_273',['list_update_policy.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01124.html',1,'']]], + ['list_5fupdate_5ftag_274',['list_update_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11263.html',1,'__gnu_pbds']]], + ['lkpyrlvl_275',['lkPyrLvl',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga59b5126cf58c191527c64234a54b876b',1,'cv::stereo::PropagationParameters::lkPyrLvl'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga59b5126cf58c191527c64234a54b876b',1,'lkPyrLvl(Global Namespace)']]], + ['lktemplatesize_276',['lkTemplateSize',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga894232404cc4ce4b8bac3bb0f3893362',1,'cv::stereo::PropagationParameters::lkTemplateSize'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga894232404cc4ce4b8bac3bb0f3893362',1,'lkTemplateSize(Global Namespace)']]], + ['lktermparam1_277',['lkTermParam1',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga0d3863109d84b3699a19da1fac633029',1,'cv::stereo::PropagationParameters::lkTermParam1'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga0d3863109d84b3699a19da1fac633029',1,'lkTermParam1(Global Namespace)']]], + ['lktermparam2_278',['lkTermParam2',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga5e19e65ee5209dda3ad2bb342a3fc5a2',1,'cv::stereo::PropagationParameters::lkTermParam2'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga5e19e65ee5209dda3ad2bb342a3fc5a2',1,'lkTermParam2(Global Namespace)']]], + ['llapi_2eh_279',['llapi.h',['https://docs.opencv.org/4.2.0/dd/df3/llapi_8h.html',1,'']]], + ['llt_280',['LLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html',1,'Eigen::LLT< class, _UpLo >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a16d1ec9ea6497ba1febb242c2e8a7a96',1,'Eigen::LLT::LLT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a1848a00addade9a0f7f70493c52ecc9d',1,'Eigen::LLT::LLT(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#ab3656cfbdf38e03c57d5cf79bf8131b6',1,'Eigen::LLT::LLT(Index size)']]], + ['llt_281',['llt',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90c45f7a30265df792d5aeaddead2635',1,'Eigen::MatrixBase::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90c45f7a30265df792d5aeaddead2635',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90c45f7a30265df792d5aeaddead2635',1,'MatrixBase< Solve< Decomposition, RhsType > >::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a405e810491642a7f7b785f2ad6f93619',1,'Eigen::SelfAdjointView::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a405e810491642a7f7b785f2ad6f93619',1,'SelfAdjointView< const Derived, UpLo >::llt()']]], + ['lmeds_282',['LMEDS',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggaaedb1f94e6b143cef163622c531afd88ae59a3f6677ddd05b96a298a6c24fcbe6',1,'cv::LMEDS'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggaaedb1f94e6b143cef163622c531afd88ae59a3f6677ddd05b96a298a6c24fcbe6',1,'LMEDS(Global Namespace)']]], + ['lmsolver_283',['LMSolver',['https://docs.opencv.org/4.2.0/d3/d6d/classcv_1_1LMSolver.html',1,'cv']]], + ['load_284',['load',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a623841c33b58ea9c4847da04607e067b',1,'cv::Algorithm::load()'],['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ac24cc2e2fc5cd1dd74fd5da31886fbb7',1,'cv::ml::ANN_MLP::load()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1datasets_1_1AR__hmdb.html#ac90c6e2af727fc53b7b0c65de75d75c9',1,'cv::datasets::AR_hmdb::load()'],['https://docs.opencv.org/4.2.0/d5/d36/classcv_1_1datasets_1_1AR__sports.html#a9e166c859594903c69aa455e6542276c',1,'cv::datasets::AR_sports::load()'],['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#a2d27bbc1d1d4fa7326848f9fae7999d7',1,'cv::BaseCascadeClassifier::load()'],['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a3ff5b7d19b3d715501b3ce4e1f0563e1',1,'cv::ml::Boost::load()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a1a5884c8cc749422f9eb77c2471958bc',1,'cv::CascadeClassifier::load()'],['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html#a69d6b25f752721f9c4f6d6a1bf66aa5d',1,'cv::datasets::Dataset::load()'],['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a9a13c065058afce14367ca44739fb4df',1,'cv::ml::DTrees::load()'],['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a90eec814e087b4d8c3ff9e92f8069f6a',1,'cv::ml::EM::load()'],['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#ae47c184a8b4234f20812abf9e7fb35f4',1,'cv::cudacodec::EncoderParams::load()'],['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1datasets_1_1FR__adience.html#a07d1b4cc4c889723ddce8871a3e163e0',1,'cv::datasets::FR_adience::load()'],['https://docs.opencv.org/4.2.0/dd/dda/classcv_1_1datasets_1_1FR__lfw.html#ab27b85e70528aeeac6d2df24de29b538',1,'cv::datasets::FR_lfw::load()'],['https://docs.opencv.org/4.2.0/d9/d14/classcv_1_1datasets_1_1GR__chalearn.html#a64506d54f0bb14d3ce08d1950ecd4fbd',1,'cv::datasets::GR_chalearn::load()'],['https://docs.opencv.org/4.2.0/d0/deb/classcv_1_1datasets_1_1GR__skig.html#a281a8a0041423d7bd251610cb40875e0',1,'cv::datasets::GR_skig::load()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a957f55d36ba2f1a2ae47883c11f4b730',1,'cv::HOGDescriptor::load()'],['https://docs.opencv.org/4.2.0/d5/d42/classcv_1_1datasets_1_1HPE__humaneva.html#a269d8987797bffb9493782a8a40ed7f5',1,'cv::datasets::HPE_humaneva::load()'],['https://docs.opencv.org/4.2.0/d6/d72/classcv_1_1datasets_1_1HPE__parse.html#a0a0b7e768f05ebc8aa5161e8c56cf514',1,'cv::datasets::HPE_parse::load()'],['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1datasets_1_1IR__affine.html#ab42ab085a182539bd9d828cbeb63328f',1,'cv::datasets::IR_affine::load()'],['https://docs.opencv.org/4.2.0/d7/d5f/classcv_1_1datasets_1_1IR__robot.html#ab2ca17a360201029a1967af34dcc283e',1,'cv::datasets::IR_robot::load()'],['https://docs.opencv.org/4.2.0/dd/d0e/classcv_1_1datasets_1_1IS__bsds.html#a77835f3c33526b756a4f6c1ef3783333',1,'cv::datasets::IS_bsds::load()'],['https://docs.opencv.org/4.2.0/d9/dbe/classcv_1_1datasets_1_1IS__weizmann.html#a11aabfdc1bcea1d9f7311f2990fce38b',1,'cv::datasets::IS_weizmann::load()'],['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#a99bf8ce6bba7fcfdd791c6e5eedae8ac',1,'cv::ml::KNearest::load()'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#ab5a8bf45f2ad6aee3b8b02a816cb1282',1,'cv::LDA::load(const String &filename)'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#ace12ed0301bbd01b8fc16934c9a4c580',1,'cv::LDA::load(const FileStorage &node)'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#af3a20a4bc0f92ca2c5c1a2e46713b2f0',1,'cv::ml::LogisticRegression::load()'],['https://docs.opencv.org/4.2.0/d9/d5c/classcv_1_1face_1_1MACE.html#aeb77d3c0143b44269c556cff10f4e4a0',1,'cv::face::MACE::load()'],['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a54407fef69977bb6344f0ec2e3678083',1,'cv::viz::Mesh::load()'],['https://docs.opencv.org/4.2.0/dc/de4/classcv_1_1datasets_1_1MSM__epfl.html#a5cea4fa9eae9bce324887310a3a31111',1,'cv::datasets::MSM_epfl::load()'],['https://docs.opencv.org/4.2.0/d2/dcc/classcv_1_1datasets_1_1MSM__middlebury.html#ae96c249cffcb6675ea6e120bcef24910',1,'cv::datasets::MSM_middlebury::load()'],['https://docs.opencv.org/4.2.0/d4/d8e/classcv_1_1ml_1_1NormalBayesClassifier.html#a147a2579967d89637f0434c261bfb1e0',1,'cv::ml::NormalBayesClassifier::load()'],['https://docs.opencv.org/4.2.0/db/df7/classcv_1_1datasets_1_1OR__imagenet.html#a5f1402f12579dbb8092ef6b5759ec455',1,'cv::datasets::OR_imagenet::load()'],['https://docs.opencv.org/4.2.0/d9/d92/classcv_1_1datasets_1_1OR__mnist.html#a471654dbc84df363ec29ca71ef68438c',1,'cv::datasets::OR_mnist::load()'],['https://docs.opencv.org/4.2.0/d4/d7e/classcv_1_1datasets_1_1OR__pascal.html#a2e4eb062497587b89f72e7495f0dfd05',1,'cv::datasets::OR_pascal::load()'],['https://docs.opencv.org/4.2.0/da/d69/classcv_1_1datasets_1_1OR__sun.html#a8cb3d99b80669c7d56c489916c541d3b',1,'cv::datasets::OR_sun::load()'],['https://docs.opencv.org/4.2.0/da/d8d/classcv_1_1datasets_1_1PD__caltech.html#ae5790097375df75df4e18f7dedfa366a',1,'cv::datasets::PD_caltech::load()'],['https://docs.opencv.org/4.2.0/d2/d61/classcv_1_1datasets_1_1PD__inria.html#afaec78fa88b3f0ad00bc9372615cb5e2',1,'cv::datasets::PD_inria::load()'],['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html#adada11573469e5df2e05da93e8239704',1,'cv::ml::RTrees::load()'],['https://docs.opencv.org/4.2.0/d6/d92/classcv_1_1datasets_1_1SLAM__kitti.html#a5df4388ba40eec6329d0b51bb9391279',1,'cv::datasets::SLAM_kitti::load()'],['https://docs.opencv.org/4.2.0/da/d91/classcv_1_1datasets_1_1SLAM__tumindoor.html#a508c646200a6f0b0a22a9d1dc69f2422',1,'cv::datasets::SLAM_tumindoor::load()'],['https://docs.opencv.org/4.2.0/d6/d05/classcv_1_1datasets_1_1SR__bsds.html#a193438fcd7b9f8b021e24bcc9cf53588',1,'cv::datasets::SR_bsds::load()'],['https://docs.opencv.org/4.2.0/d2/db5/classcv_1_1datasets_1_1SR__div2k.html#a6f5f65f5cbbade9f9cb98ea0037a541c',1,'cv::datasets::SR_div2k::load()'],['https://docs.opencv.org/4.2.0/d5/d19/classcv_1_1datasets_1_1SR__general100.html#a56fe96bac637d69ab01b8a815395d21d',1,'cv::datasets::SR_general100::load()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a7b05db6110aec2246f2b31363937539c',1,'cv::ml::SVM::load()'],['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a6945188e89c36b33187ab57dbc2364dc',1,'cv::ml::SVMSGD::load()'],['https://docs.opencv.org/4.2.0/d7/dc3/classcv_1_1datasets_1_1TR__chars.html#a4f357a12c26753335f5d7ff90f9cae3d',1,'cv::datasets::TR_chars::load()'],['https://docs.opencv.org/4.2.0/d7/dfb/classcv_1_1datasets_1_1TR__icdar.html#a803e5f1bfddaa201506204c51fb01f3d',1,'cv::datasets::TR_icdar::load()'],['https://docs.opencv.org/4.2.0/da/dc9/classcv_1_1datasets_1_1TR__svt.html#af4293f31c65df7994d06ccd06a57dd8d',1,'cv::datasets::TR_svt::load()'],['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a2518906ab9f5a89984f039fc737934d9',1,'cv::datasets::TRACK_alov::load()'],['https://docs.opencv.org/4.2.0/dc/d52/classcv_1_1datasets_1_1TRACK__vot.html#ac7dffefce0a572517d46728eddb76e74',1,'cv::datasets::TRACK_vot::load()']]], + ['load_20and_20display_20an_20image_285',['Load and Display an Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'']]], + ['load_20caffe_20framework_20models_286',['Load Caffe framework models',['https://docs.opencv.org/4.2.0/d5/de7/tutorial_dnn_googlenet.html',1,'']]], + ['load_20modify_20and_20save_20an_20image_287',['Load, Modify, and Save an Image',['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'']]], + ['load_5fauto_288',['LOAD_AUTO',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a0282a666ca11b5ae82b3eaf57e28ac45abc0ec20ee29622eb7d340b8da60c644f',1,'cv::viz::Mesh']]], + ['load_5ffactor_289',['load_factor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#add961e22f4549e2c94846946fbd25a7d',1,'std::unordered_map::load_factor()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a02888ba9dce21c5e16ba09734ebdb642',1,'std::unordered_multimap::load_factor()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a4105eeac8ec00dc431b408e8d046dd5e',1,'std::unordered_multiset::load_factor()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a6e7300347a4173c3ad35217600d28f50',1,'std::unordered_set::load_factor()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#add961e22f4549e2c94846946fbd25a7d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::load_factor()']]], + ['load_5fobj_290',['LOAD_OBJ',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a0282a666ca11b5ae82b3eaf57e28ac45ac0b9804b46088d052fc6ea4aff94ed7b',1,'cv::viz::Mesh']]], + ['load_5fply_291',['LOAD_PLY',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a0282a666ca11b5ae82b3eaf57e28ac45a7874520d2defcbccddf5032359171385',1,'cv::viz::Mesh']]], + ['load_5fsave_5fimage_2emarkdown_292',['load_save_image.markdown',['https://docs.opencv.org/4.2.0/d2/d4f/load__save__image_8markdown.html',1,'']]], + ['loadannotatedonly_293',['loadAnnotatedOnly',['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a19bb9f5aae3ffdbf6b4b770e7b63ef98',1,'cv::datasets::TRACK_alov']]], + ['loadclassifiernm1_294',['loadClassifierNM1',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga8a0e90a70de747b993be34ed7933ef53',1,'cv::text::loadClassifierNM1()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga8a0e90a70de747b993be34ed7933ef53',1,'loadClassifierNM1()(Global Namespace)']]], + ['loadclassifiernm2_295',['loadClassifierNM2',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga7a7555ebd0850765e1cb09d322235cf8',1,'cv::text::loadClassifierNM2()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga7a7555ebd0850765e1cb09d322235cf8',1,'loadClassifierNM2()(Global Namespace)']]], + ['loaddatasetlist_296',['loadDatasetList',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#ga02020fc9f387bb043a478fe5f112bb8d',1,'cv::face::loadDatasetList()'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#ga02020fc9f387bb043a478fe5f112bb8d',1,'loadDatasetList()(Global Namespace)']]], + ['loadfacepoints_297',['loadFacePoints',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gab70c6fb08756f867d6160099907202a5',1,'cv::face::loadFacePoints()'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gab70c6fb08756f867d6160099907202a5',1,'loadFacePoints()(Global Namespace)']]], + ['loadfontdata_298',['loadFontData',['https://docs.opencv.org/4.2.0/d9/dfa/classcv_1_1freetype_1_1FreeType2.html#af059d49b806b916ffdd6380b9eb2f59a',1,'cv::freetype::FreeType2']]], + ['loadfromcsv_299',['loadFromCSV',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#ab3264a32194126ff8d6821e76018cde3',1,'cv::ml::TrainData']]], + ['loadfromstring_300',['loadFromString',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a3ba305a10d02479c13cf7d169c321547',1,'cv::Algorithm']]], + ['loadimages_301',['loadImages',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#ab4094252884b5da9d5f33fcaea29bb09',1,'cv::multicalib::MultiCameraCalibration']]], + ['loadmodel_302',['loadModel',['https://docs.opencv.org/4.2.0/db/dd8/classcv_1_1face_1_1Facemark.html#a43fafd5248ab26db7cbdd8bf5a4f8266',1,'cv::face::Facemark']]], + ['loadnet_303',['loadNet',['https://docs.opencv.org/4.2.0/d7/d8d/classcv_1_1cnn__3dobj_1_1descriptorExtractor.html#a2b758899b6f1f6adfb2c772938943df2',1,'cv::cnn_3dobj::descriptorExtractor']]], + ['loadocrbeamsearchclassifiercnn_304',['loadOCRBeamSearchClassifierCNN',['https://docs.opencv.org/4.2.0/d8/de7/namespacecv_1_1text.html#ac30595bd0b171889aee9f3f62f0b966e',1,'cv::text']]], + ['loadocrhmmclassifier_305',['loadOCRHMMClassifier',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga1d0cf1516cf8cfb2e53fdf639d547119',1,'cv::text::loadOCRHMMClassifier()'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga1d0cf1516cf8cfb2e53fdf639d547119',1,'loadOCRHMMClassifier()(Global Namespace)']]], + ['loadocrhmmclassifiercnn_306',['loadOCRHMMClassifierCNN',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga8368b390a06f0323f9dead526337f6a3',1,'cv::text::loadOCRHMMClassifierCNN()'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga8368b390a06f0323f9dead526337f6a3',1,'loadOCRHMMClassifierCNN()(Global Namespace)']]], + ['loadocrhmmclassifiernm_307',['loadOCRHMMClassifierNM',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gad20627dd74a441192dc327adc9f9356d',1,'cv::text::loadOCRHMMClassifierNM()'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gad20627dd74a441192dc327adc9f9356d',1,'loadOCRHMMClassifierNM()(Global Namespace)']]], + ['loadparameters_308',['loadParameters',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga9dc72c2a623574a50d553d3b2ffd4e52',1,'cv::stereo::QuasiDenseStereo::loadParameters()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga9dc72c2a623574a50d553d3b2ffd4e52',1,'loadParameters()(Global Namespace)']]], + ['loadpattern_309',['loadPattern',['https://docs.opencv.org/4.2.0/df/d8d/classcv_1_1randpattern_1_1RandomPatternCornerFinder.html#a56c6e69acc77b059df1e31ab3165e64a',1,'cv::randpattern::RandomPatternCornerFinder::loadPattern(const cv::Mat &patternImage)'],['https://docs.opencv.org/4.2.0/df/d8d/classcv_1_1randpattern_1_1RandomPatternCornerFinder.html#aeb584b73b5d3458bb09a115a6a676f8e',1,'cv::randpattern::RandomPatternCornerFinder::loadPattern(const cv::Mat &patternImage, const std::vector< cv::KeyPoint > &patternKeyPoints, const cv::Mat &patternDescriptors)']]], + ['loadplysimple_310',['loadPLYSimple',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gad893719cc47a72b24482f2bfdebb409e',1,'cv::ppf_match_3d::loadPLYSimple()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gad893719cc47a72b24482f2bfdebb409e',1,'loadPLYSimple()(Global Namespace)']]], + ['loadtrainingdata_311',['loadTrainingData',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gacd36ecb8de65bd12d8420d4a0ae98a4b',1,'cv::face::loadTrainingData(String filename, std::vector< String > &images, OutputArray facePoints, char delim=' ', float offset=0.0f)'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#ga9bbdd4136cc1eee55586b5f115d8a3a8',1,'cv::face::loadTrainingData(String imageList, String groundTruth, std::vector< String > &images, OutputArray facePoints, float offset=0.0f)'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gac3a2d046686d932425d2601b640d97d3',1,'cv::face::loadTrainingData(std::vector< String > filename, std::vector< std::vector< Point2f > > &trainlandmarks, std::vector< String > &trainimages)'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gacd36ecb8de65bd12d8420d4a0ae98a4b',1,'loadTrainingData(String filename, std::vector< String > &images, OutputArray facePoints, char delim=' ', float offset=0.0f)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#ga9bbdd4136cc1eee55586b5f115d8a3a8',1,'loadTrainingData(String imageList, String groundTruth, std::vector< String > &images, OutputArray facePoints, float offset=0.0f)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gac3a2d046686d932425d2601b640d97d3',1,'loadTrainingData(std::vector< String > filename, std::vector< std::vector< Point2f > > &trainlandmarks, std::vector< String > &trainimages)(Global Namespace)']]], + ['loadwindowparameters_312',['loadWindowParameters',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga8e6806c75e016cf22d998b4d454b3bfd',1,'cv::loadWindowParameters()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga8e6806c75e016cf22d998b4d454b3bfd',1,'loadWindowParameters()(Global Namespace)']]], + ['local_313',['LOCAL',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a1010adb068498c191b8079323ad790f9a635cd42ccd784e7c833a2d335bf483bf',1,'cv::ocl::KernelArg']]], + ['local_314',['Local',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#ae99e4f30c874011acee657294d077b36',1,'cv::ocl::KernelArg']]], + ['local_20features_20matching_315',['AKAZE local features matching',['https://docs.opencv.org/4.2.0/db/d70/tutorial_akaze_matching.html',1,'']]], + ['local_5fis_5fglobal_316',['LOCAL_IS_GLOBAL',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a863c26836094911821d04c7e105e4733ac4e8cafe65632d793cec03066db2c598',1,'cv::ocl::Device']]], + ['local_5fis_5flocal_317',['LOCAL_IS_LOCAL',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a863c26836094911821d04c7e105e4733affd140fc55eece28a64ce7e002fcab8d',1,'cv::ocl::Device']]], + ['local_5fiterator_318',['local_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aab940536a56eb520d8e7143ce5c4af3a',1,'std::unordered_map::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aab940536a56eb520d8e7143ce5c4af3a',1,'std::unordered_map::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a8cb5d0ca110f847b3fceed2d07472710',1,'std::unordered_multimap::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a8cb5d0ca110f847b3fceed2d07472710',1,'std::unordered_multimap::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a2b13af1127b00c668e4e277c0053c2c3',1,'std::unordered_multiset::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a2b13af1127b00c668e4e277c0053c2c3',1,'std::unordered_multiset::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a41daefac0150734553a1b8ae994520e6',1,'std::unordered_set::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a41daefac0150734553a1b8ae994520e6',1,'std::unordered_set::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aab940536a56eb520d8e7143ce5c4af3a',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aab940536a56eb520d8e7143ce5c4af3a',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::local_iterator']]], + ['local_5fmaxima_319',['local_maxima',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a07d1fb6d7d3ea7c129cedc76a2589ad4',1,'cv::text::ERStat']]], + ['localadaptintegration_5fk_320',['localAdaptintegration_k',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a1246bbabc4fe4ddb24c8bce5f62bdf33',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters']]], + ['localadaptintegration_5ftau_321',['localAdaptintegration_tau',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#addc4f8df07a7e35b6eaf59ec167cdbf3',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters']]], + ['localbinarizationmethods_322',['LocalBinarizationMethods',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a77765f3d60539a658097c1dd8faedf24',1,'cv::ximgproc']]], + ['locale_323',['locale',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html',1,'std::locale'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00101.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#af149bfda05282c1f7c62973c887d77e6',1,'std::locale::locale()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#ade071b7e4275c4a8889b09e86d1c26fb',1,'std::locale::locale(const locale &__other)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a268965d97cffcf472d2f0fa8b74aa1e2',1,'std::locale::locale(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a964af00c8b1c09375ca7abd5bdf8922f',1,'std::locale::locale(const locale &__base, const char *__s, category __cat)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a85e91d15c668e3455ff2a1eda4e6784a',1,'std::locale::locale(const std::string &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a918d906d5f6fc923db96a72021ad5aab',1,'std::locale::locale(const locale &__base, const std::string &__s, category __cat)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#af050b38ebd4f015ef0fe4b64f3087d42',1,'std::locale::locale(const locale &__base, const locale &__add, category __cat)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a9a3183dbb40c79006a1de940775ce704',1,'std::locale::locale(const locale &__other, _Facet *__f)']]], + ['locale_5fclasses_2eh_324',['locale_classes.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00395.html',1,'']]], + ['locale_5fclasses_2etcc_325',['locale_classes.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00398.html',1,'']]], + ['locale_5fconv_2eh_326',['locale_conv.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00401.html',1,'']]], + ['locale_5ffacets_2eh_327',['locale_facets.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00404.html',1,'']]], + ['locale_5ffacets_2etcc_328',['locale_facets.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00407.html',1,'']]], + ['locale_5ffacets_5fnonio_2eh_329',['locale_facets_nonio.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00410.html',1,'']]], + ['locale_5ffacets_5fnonio_2etcc_330',['locale_facets_nonio.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00413.html',1,'']]], + ['localefwd_2eh_331',['localefwd.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00416.html',1,'']]], + ['localenergy_5fspatialconstant_332',['localEnergy_spatialConstant',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#a187f15eb270d566533d9684a66f5a691',1,'cv::bioinspired::SegmentationParameters']]], + ['localenergy_5ftemporalconstant_333',['localEnergy_temporalConstant',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#a89acec017f2fc4fbc03f6ecd281c4185',1,'cv::bioinspired::SegmentationParameters']]], + ['locales_334',['Locales',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01498.html',1,'']]], + ['localmemsize_335',['localMemSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a92e2c210bf5f352d2a742434aca02271',1,'cv::ocl::Device::localMemSize()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a9a22e8dbd4fd080ac2c1946d1bae220c',1,'cv::ocl::Kernel::localMemSize()']]], + ['localmemtype_336',['localMemType',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a610127a076485b2179bb4bcd25c46f56',1,'cv::ocl::Device']]], + ['locate_337',['locate',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aec8f1fd5a802f62faa97520b465897d7',1,'cv::Subdiv2D']]], + ['locateroi_338',['locateROI',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a934d25560bfb1f03c0077e437d41e0cb',1,'cv::cuda::GpuMat::locateROI()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a40b5b3371a9c2a4b2b8ce0c8068d7c96',1,'cv::Mat::locateROI()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a657631fc34ff89a3e2e921122c45c667',1,'cv::UMat::locateROI()']]], + ['location_339',['location',['https://docs.opencv.org/4.2.0/d1/dda/structcv_1_1DetectionBasedTracker_1_1ExtObject.html#ae35c2f8e432191e876da162978ffdbfb',1,'cv::DetectionBasedTracker::ExtObject']]], + ['location_20in_20subpixels_340',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], + ['location_5frow_341',['LOCATION_ROW',['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#addb10a677428002c0202178578f1cc25',1,'cv::cuda::FastFeatureDetector']]], + ['locations_342',['locations',['https://docs.opencv.org/4.2.0/d3/d34/structcv_1_1DetectionROI.html#a9e3ba3daa336f41774e72b8ee2787876',1,'cv::DetectionROI']]], + ['lock_343',['lock',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#afd0d8141835b66eb92cd65c4d2f25b51',1,'cv::UMatData::lock()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a82fa606b1427f731ac64bb8ac49221f3',1,'std::lock()']]], + ['lock_2eprivate_2ehpp_344',['lock.private.hpp',['https://docs.opencv.org/4.2.0/d2/d1a/lock_8private_8hpp.html',1,'']]], + ['lock_5fguard_345',['lock_guard',['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1utils_1_1lock__guard.html',1,'cv::utils::lock_guard< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07207.html',1,'std::lock_guard< class >'],['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1utils_1_1lock__guard.html#a2ba70ea4aedbf1a96de94be8dfa0b7c2',1,'cv::utils::lock_guard::lock_guard()']]], + ['log_346',['log',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a61821aff05bfa68006c5a960bef5d238',1,'cv::videostab::StabilizerBase::log()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a4dc57b319fc1cf8c9035016e56602a7d',1,'Eigen::MatrixBase::log()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a4dc57b319fc1cf8c9035016e56602a7d',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::log()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a4dc57b319fc1cf8c9035016e56602a7d',1,'MatrixBase< Solve< Decomposition, RhsType > >::log()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae5de78ee278fe88405c6dbc38502f7c1',1,'cv::log(const softfloat &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga54b0b6e1873fb3a4b1db47252d79b8d3',1,'cv::log(const softdouble &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga937ecdce4679a77168730830a955bea7',1,'cv::log(InputArray src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gaae9c60739e2d1a977b4d3250a0be42ca',1,'cv::cuda::log()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08539cfb85017a1c48505908d55e137b',1,'cv::cudev::log(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaeab3883c578b3e6fe8ebf29dbcfdcf9',1,'cv::cudev::log(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac42b7d2fece624ad6ed6eaae3d50dfb1',1,'cv::cudev::log(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eebb9ca628f9c4d629740d9b1c38bca',1,'cv::cudev::log(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaadf7d6ad25906b309fa822fd4a4a16a',1,'cv::cudev::log(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ea65e4bfdfe10dadd150b658cbfccb2',1,'cv::cudev::log(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e961864775dc92330f5713d0981e554',1,'cv::cudev::log(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd19caa726a85fae1b400fe1660713f4',1,'cv::cudev::log(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae44cc350406e393060be02ebd1526808',1,'cv::cudev::log(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35c865dcd20b2af38c11c50a8c6b2be7',1,'cv::cudev::log(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf424c0846ae2028055cbe5e85195c8e0',1,'cv::cudev::log(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga116165f0cdd7f56b58e374dec6a65d41',1,'cv::cudev::log(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94cd6c21b8065a839d1ea04d1bad63fa',1,'cv::cudev::log(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23d270d966b55005aa42fa732ca91fbd',1,'cv::cudev::log(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7623fbca3fbca124c13443cf1723b808',1,'cv::cudev::log(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98bd27047780975443e4f6e130e3dda',1,'cv::cudev::log(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4db909814e37255641a8e93e419fc69f',1,'cv::cudev::log(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3994783ad220e421e7ad289e1a54edd0',1,'cv::cudev::log(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fdb2dfc034c831469ab4c5a6393a4df',1,'cv::cudev::log(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdb321b25c6693af8f074a7a60e3a465',1,'cv::cudev::log(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf34f4fdce0642c4fd19b54aab55e81c',1,'cv::cudev::log(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a0198cbd63755cc27e161f15ec58f10',1,'cv::cudev::log(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04f5e5c1b5501958b548a8556018a96a',1,'cv::cudev::log(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a2f6d0839322b502807f2dafd14e4e1',1,'cv::cudev::log(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac522a70418ee8a7a615161c34e107584',1,'cv::cudev::log(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab52151ba258ab3520c79a74bdc05ba88',1,'cv::cudev::log(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac17e2aa1d718d5d66415928ba6126790',1,'cv::cudev::log(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9838971ae145cd904cea0dca62b44a0b',1,'cv::cudev::log(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfcc2d88806c052b4286760fbd509eb6',1,'cv::cudev::log(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga218099ad9af6e76a22531117d4612851',1,'cv::cudev::log(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9360486e5b048b473e854e751baa7e4',1,'cv::cudev::log(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e013413fdd351af4efffff15c0201d',1,'cv::cudev::log(const double4 &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga937ecdce4679a77168730830a955bea7',1,'log(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae5de78ee278fe88405c6dbc38502f7c1',1,'log(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga54b0b6e1873fb3a4b1db47252d79b8d3',1,'log(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gaae9c60739e2d1a977b4d3250a0be42ca',1,'log(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08539cfb85017a1c48505908d55e137b',1,'log(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaeab3883c578b3e6fe8ebf29dbcfdcf9',1,'log(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac42b7d2fece624ad6ed6eaae3d50dfb1',1,'log(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eebb9ca628f9c4d629740d9b1c38bca',1,'log(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaadf7d6ad25906b309fa822fd4a4a16a',1,'log(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ea65e4bfdfe10dadd150b658cbfccb2',1,'log(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e961864775dc92330f5713d0981e554',1,'log(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd19caa726a85fae1b400fe1660713f4',1,'log(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae44cc350406e393060be02ebd1526808',1,'log(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35c865dcd20b2af38c11c50a8c6b2be7',1,'log(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf424c0846ae2028055cbe5e85195c8e0',1,'log(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga116165f0cdd7f56b58e374dec6a65d41',1,'log(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94cd6c21b8065a839d1ea04d1bad63fa',1,'log(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23d270d966b55005aa42fa732ca91fbd',1,'log(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7623fbca3fbca124c13443cf1723b808',1,'log(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98bd27047780975443e4f6e130e3dda',1,'log(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4db909814e37255641a8e93e419fc69f',1,'log(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3994783ad220e421e7ad289e1a54edd0',1,'log(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fdb2dfc034c831469ab4c5a6393a4df',1,'log(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdb321b25c6693af8f074a7a60e3a465',1,'log(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf34f4fdce0642c4fd19b54aab55e81c',1,'log(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a0198cbd63755cc27e161f15ec58f10',1,'log(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04f5e5c1b5501958b548a8556018a96a',1,'log(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a2f6d0839322b502807f2dafd14e4e1',1,'log(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac522a70418ee8a7a615161c34e107584',1,'log(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab52151ba258ab3520c79a74bdc05ba88',1,'log(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac17e2aa1d718d5d66415928ba6126790',1,'log(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9838971ae145cd904cea0dca62b44a0b',1,'log(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfcc2d88806c052b4286760fbd509eb6',1,'log(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga218099ad9af6e76a22531117d4612851',1,'log(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9360486e5b048b473e854e751baa7e4',1,'log(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e013413fdd351af4efffff15c0201d',1,'log(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga42f2de63a5c18a149f94b926d4d6bb21',1,'std::log()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga42f2de63a5c18a149f94b926d4d6bb21',1,'log()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae8bb75ba4f5f30a7571146dbfa653c6d',1,'Eigen::log()']]], + ['log_2ehpp_347',['log.hpp',['https://docs.opencv.org/4.2.0/d4/d3d/log_8hpp.html',1,'']]], + ['log10_348',['log10',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d7f752d82c289caa24bbb5a278ac31d',1,'cv::cudev::log10(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f5cc2406a29379d2a8baf217afd6771',1,'cv::cudev::log10(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga885bb7ec4778055a672d8d1804e89c83',1,'cv::cudev::log10(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ba08a48039960de46e02eb8cd2f75f7',1,'cv::cudev::log10(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e2344af6c50f3ff3cbe67a5f4c56263',1,'cv::cudev::log10(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4ee0839d0b5ce07fb2ee0a79c798a7f',1,'cv::cudev::log10(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9aa7df33af81be99a8d22ea4a0f96d6',1,'cv::cudev::log10(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbefd60fcb108477d45f6080dbd51586',1,'cv::cudev::log10(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20752f0ddffd9bafb163a72bc655d207',1,'cv::cudev::log10(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga707a022d851b055fe0decd844a611029',1,'cv::cudev::log10(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade43b36347b2f0aaf59e3a4b970c0a69',1,'cv::cudev::log10(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddf09f912c40d8e70bbd8b45a36f1142',1,'cv::cudev::log10(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0bf8ec1996e77e126443790887c9752',1,'cv::cudev::log10(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga348e21a5e5da04325fa534417ab2a30c',1,'cv::cudev::log10(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab1b7872f35256389dcaff634d54606f',1,'cv::cudev::log10(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga498eb71a49f4e18b369ec334987679b9',1,'cv::cudev::log10(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32295f0c1b1c66e85b6c1fc5e45bea2e',1,'cv::cudev::log10(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga623a9fd76452b82cc8400dbcd76a393a',1,'cv::cudev::log10(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcac50339c24b2ba6ce3684bcff5a804',1,'cv::cudev::log10(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1a2eaab43233ef945690875e04145a6',1,'cv::cudev::log10(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga081b555d0461f416b7922f5e7554eb9e',1,'cv::cudev::log10(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac58ed812725e53e979f66bbbd8d23c7e',1,'cv::cudev::log10(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga789314f8325f905eab00ab6053d7535a',1,'cv::cudev::log10(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f229460ea5ea56194553ffcaf515d5a',1,'cv::cudev::log10(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42ad6387243d672cddf22363b235e03d',1,'cv::cudev::log10(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4206efef60aa6afb81347138c7bb94',1,'cv::cudev::log10(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b13e9d0bdaf5f938175766fb88c6ba9',1,'cv::cudev::log10(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bc4919079c485e785b67ccc0e52753d',1,'cv::cudev::log10(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c5738ee979615242de5cb51f459f110',1,'cv::cudev::log10(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40389fe08e2f0f7a30a2da84c4de4b5b',1,'cv::cudev::log10(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefb429f0854a5dfc8dc864d2d6f57da2',1,'cv::cudev::log10(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54055600516173a28ca0a695fca1fac1',1,'cv::cudev::log10(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d7f752d82c289caa24bbb5a278ac31d',1,'log10(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f5cc2406a29379d2a8baf217afd6771',1,'log10(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga885bb7ec4778055a672d8d1804e89c83',1,'log10(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ba08a48039960de46e02eb8cd2f75f7',1,'log10(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e2344af6c50f3ff3cbe67a5f4c56263',1,'log10(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4ee0839d0b5ce07fb2ee0a79c798a7f',1,'log10(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9aa7df33af81be99a8d22ea4a0f96d6',1,'log10(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbefd60fcb108477d45f6080dbd51586',1,'log10(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20752f0ddffd9bafb163a72bc655d207',1,'log10(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga707a022d851b055fe0decd844a611029',1,'log10(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade43b36347b2f0aaf59e3a4b970c0a69',1,'log10(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddf09f912c40d8e70bbd8b45a36f1142',1,'log10(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0bf8ec1996e77e126443790887c9752',1,'log10(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga348e21a5e5da04325fa534417ab2a30c',1,'log10(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab1b7872f35256389dcaff634d54606f',1,'log10(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga498eb71a49f4e18b369ec334987679b9',1,'log10(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32295f0c1b1c66e85b6c1fc5e45bea2e',1,'log10(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga623a9fd76452b82cc8400dbcd76a393a',1,'log10(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcac50339c24b2ba6ce3684bcff5a804',1,'log10(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1a2eaab43233ef945690875e04145a6',1,'log10(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga081b555d0461f416b7922f5e7554eb9e',1,'log10(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac58ed812725e53e979f66bbbd8d23c7e',1,'log10(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga789314f8325f905eab00ab6053d7535a',1,'log10(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f229460ea5ea56194553ffcaf515d5a',1,'log10(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42ad6387243d672cddf22363b235e03d',1,'log10(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4206efef60aa6afb81347138c7bb94',1,'log10(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b13e9d0bdaf5f938175766fb88c6ba9',1,'log10(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bc4919079c485e785b67ccc0e52753d',1,'log10(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c5738ee979615242de5cb51f459f110',1,'log10(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40389fe08e2f0f7a30a2da84c4de4b5b',1,'log10(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefb429f0854a5dfc8dc864d2d6f57da2',1,'log10(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54055600516173a28ca0a695fca1fac1',1,'log10(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga070941f6cb66b0e4619891010c008250',1,'std::log10()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga070941f6cb66b0e4619891010c008250',1,'log10()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a25256faeec3ffd0f3615a0e1e45dfb14',1,'Eigen::log10()']]], + ['log10_5f_349',['log10_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9255b842159fcf1ba4097b4b49284eae',1,'cv::cudev::log10_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9255b842159fcf1ba4097b4b49284eae',1,'log10_()(Global Namespace)']]], + ['log10_5ffunc_350',['log10_func',['https://docs.opencv.org/4.2.0/d8/da8/structcv_1_1cudev_1_1log10__func.html',1,'cv::cudev']]], + ['log10_5ffunc_3c_20double_20_3e_351',['log10_func< double >',['https://docs.opencv.org/4.2.0/dc/d32/structcv_1_1cudev_1_1log10__func_3_01double_01_4.html',1,'cv::cudev']]], + ['log10_5ffunc_3c_20float_20_3e_352',['log10_func< float >',['https://docs.opencv.org/4.2.0/d0/d42/structcv_1_1cudev_1_1log10__func_3_01float_01_4.html',1,'cv::cudev']]], + ['log10_5ffunc_3c_20schar_20_3e_353',['log10_func< schar >',['https://docs.opencv.org/4.2.0/dd/d4b/structcv_1_1cudev_1_1log10__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['log10_5ffunc_3c_20short_20_3e_354',['log10_func< short >',['https://docs.opencv.org/4.2.0/d9/d00/structcv_1_1cudev_1_1log10__func_3_01short_01_4.html',1,'cv::cudev']]], + ['log10_5ffunc_3c_20uchar_20_3e_355',['log10_func< uchar >',['https://docs.opencv.org/4.2.0/dd/dcc/structcv_1_1cudev_1_1log10__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['log10_5ffunc_3c_20uint_20_3e_356',['log10_func< uint >',['https://docs.opencv.org/4.2.0/df/d6e/structcv_1_1cudev_1_1log10__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['log10_5ffunc_3c_20ushort_20_3e_357',['log10_func< ushort >',['https://docs.opencv.org/4.2.0/d0/df1/structcv_1_1cudev_1_1log10__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['log1p_358',['log1p',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ac5c8a2cded6b59628f2de04f24d2fff4',1,'Eigen']]], + ['log2_359',['Log2',['https://docs.opencv.org/4.2.0/d5/da6/structcv_1_1cudev_1_1Log2.html',1,'cv::cudev']]], + ['log2_360',['log2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af298b9380058e91b466225dd4da95b',1,'cv::cudev::log2(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84accb697a90868cc966ae3d78f8088b',1,'cv::cudev::log2(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f96d1e89c07ea9b34159ee293577317',1,'cv::cudev::log2(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1d0331e894382a5288768bee795f70e',1,'cv::cudev::log2(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga092163e53624a085da2281618a7c8993',1,'cv::cudev::log2(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2648fce709533184caa8e046651c30f2',1,'cv::cudev::log2(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a796696b3b511da92ab22fd89d9c3eb',1,'cv::cudev::log2(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ab6c123ba4a2bcbbcfcc333d46ed84a',1,'cv::cudev::log2(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d8cc2b3a27d520f1cab2149bbdee856',1,'cv::cudev::log2(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa48b21b8043d227d2cfb7eeaea0fd223',1,'cv::cudev::log2(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7088ac0261fc793473797fd16fc4fa32',1,'cv::cudev::log2(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0893395683ac8f446357c5c78aca45',1,'cv::cudev::log2(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f139df681666d15bb68cbef046853ee',1,'cv::cudev::log2(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ce2b6db24956d2d3298ed5e58ec4c70',1,'cv::cudev::log2(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac17ee8fc39724da14517c0a5bce64348',1,'cv::cudev::log2(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75aa279efb8d46242a63fad03e1d19c1',1,'cv::cudev::log2(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6886c5775cd56741faa0724a19e6695',1,'cv::cudev::log2(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga674d3cfe043cfffab22e6ae8bc6652e2',1,'cv::cudev::log2(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8114a66542a3392bc0e79f06bb4d186',1,'cv::cudev::log2(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62966501aa6c0fe9bec42eb26d00ae8a',1,'cv::cudev::log2(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga000821a347070e9dce650e634d07812c',1,'cv::cudev::log2(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcd61eab552c49a1247e6e23e0898297',1,'cv::cudev::log2(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03065945aac3211c265db654c39e6dc9',1,'cv::cudev::log2(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5881314f1fb87883c129c0bf9730d3c',1,'cv::cudev::log2(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga585e2ee38f000c0419d6940ee7824048',1,'cv::cudev::log2(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d36bd4b3ce78779f972805992dfe19c',1,'cv::cudev::log2(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6646bc72c8a3312d547105b3b787a28',1,'cv::cudev::log2(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5fa31e95f99bf4d0e39ec7374bc9add',1,'cv::cudev::log2(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbf81d98455601fea8a5eedee7e6bd53',1,'cv::cudev::log2(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga870a9ffd33e83157c00439289f666fe4',1,'cv::cudev::log2(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06fb539e7d65165a8e5ccbdeac4a63ad',1,'cv::cudev::log2(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd1e01e7ec3a0d09753c4c072375460',1,'cv::cudev::log2(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af298b9380058e91b466225dd4da95b',1,'log2(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84accb697a90868cc966ae3d78f8088b',1,'log2(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f96d1e89c07ea9b34159ee293577317',1,'log2(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1d0331e894382a5288768bee795f70e',1,'log2(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga092163e53624a085da2281618a7c8993',1,'log2(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2648fce709533184caa8e046651c30f2',1,'log2(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a796696b3b511da92ab22fd89d9c3eb',1,'log2(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ab6c123ba4a2bcbbcfcc333d46ed84a',1,'log2(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d8cc2b3a27d520f1cab2149bbdee856',1,'log2(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa48b21b8043d227d2cfb7eeaea0fd223',1,'log2(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7088ac0261fc793473797fd16fc4fa32',1,'log2(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0893395683ac8f446357c5c78aca45',1,'log2(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f139df681666d15bb68cbef046853ee',1,'log2(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ce2b6db24956d2d3298ed5e58ec4c70',1,'log2(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac17ee8fc39724da14517c0a5bce64348',1,'log2(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75aa279efb8d46242a63fad03e1d19c1',1,'log2(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6886c5775cd56741faa0724a19e6695',1,'log2(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga674d3cfe043cfffab22e6ae8bc6652e2',1,'log2(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8114a66542a3392bc0e79f06bb4d186',1,'log2(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62966501aa6c0fe9bec42eb26d00ae8a',1,'log2(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga000821a347070e9dce650e634d07812c',1,'log2(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcd61eab552c49a1247e6e23e0898297',1,'log2(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03065945aac3211c265db654c39e6dc9',1,'log2(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5881314f1fb87883c129c0bf9730d3c',1,'log2(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga585e2ee38f000c0419d6940ee7824048',1,'log2(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d36bd4b3ce78779f972805992dfe19c',1,'log2(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6646bc72c8a3312d547105b3b787a28',1,'log2(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5fa31e95f99bf4d0e39ec7374bc9add',1,'log2(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbf81d98455601fea8a5eedee7e6bd53',1,'log2(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga870a9ffd33e83157c00439289f666fe4',1,'log2(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06fb539e7d65165a8e5ccbdeac4a63ad',1,'log2(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd1e01e7ec3a0d09753c4c072375460',1,'log2(const double4 &a)(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad2d0241ffaaa3b0b04ec70b59ab066d4',1,'Eigen::log2()']]], + ['log2_3c_20n_2c_200_2c_20count_20_3e_361',['Log2< N, 0, COUNT >',['https://docs.opencv.org/4.2.0/d5/d16/structcv_1_1cudev_1_1Log2_3_01N_00_010_00_01COUNT_01_4.html',1,'cv::cudev']]], + ['log2_5f_362',['log2_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e7ce936100b248a5704a561dd485536',1,'cv::cudev::log2_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e7ce936100b248a5704a561dd485536',1,'log2_()(Global Namespace)']]], + ['log2_5ffunc_363',['log2_func',['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1cudev_1_1log2__func.html',1,'cv::cudev']]], + ['log2_5ffunc_3c_20double_20_3e_364',['log2_func< double >',['https://docs.opencv.org/4.2.0/dc/d17/structcv_1_1cudev_1_1log2__func_3_01double_01_4.html',1,'cv::cudev']]], + ['log2_5ffunc_3c_20float_20_3e_365',['log2_func< float >',['https://docs.opencv.org/4.2.0/db/dba/structcv_1_1cudev_1_1log2__func_3_01float_01_4.html',1,'cv::cudev']]], + ['log2_5ffunc_3c_20schar_20_3e_366',['log2_func< schar >',['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1log2__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['log2_5ffunc_3c_20short_20_3e_367',['log2_func< short >',['https://docs.opencv.org/4.2.0/d6/d0b/structcv_1_1cudev_1_1log2__func_3_01short_01_4.html',1,'cv::cudev']]], + ['log2_5ffunc_3c_20uchar_20_3e_368',['log2_func< uchar >',['https://docs.opencv.org/4.2.0/d6/d41/structcv_1_1cudev_1_1log2__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['log2_5ffunc_3c_20uint_20_3e_369',['log2_func< uint >',['https://docs.opencv.org/4.2.0/df/d69/structcv_1_1cudev_1_1log2__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['log2_5ffunc_3c_20ushort_20_3e_370',['log2_func< ushort >',['https://docs.opencv.org/4.2.0/d0/dda/structcv_1_1cudev_1_1log2__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['log32f_371',['log32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2b1d931c2cdadf3623d57a853b370147',1,'cv::hal::log32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2b1d931c2cdadf3623d57a853b370147',1,'log32f()(Global Namespace)']]], + ['log64f_372',['log64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3c28878c1a05aabd1bca73992346c88f',1,'cv::hal::log64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3c28878c1a05aabd1bca73992346c88f',1,'log64f()(Global Namespace)']]], + ['log_5f_373',['log_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a3d134bf4df68ce2a559d5d69fb187c88',1,'cv::videostab::StabilizerBase::log_'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe5e4a19d566fae00ec99edba171c767',1,'cv::cudev::log_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe5e4a19d566fae00ec99edba171c767',1,'log_()(Global Namespace)']]], + ['log_5feps_374',['log_eps',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#ab4fc6b7c1555341b0ceb0f4774e5e8d1',1,'cv::line_descriptor::LSDParam']]], + ['log_5ffunc_375',['log_func',['https://docs.opencv.org/4.2.0/dc/d41/structcv_1_1cudev_1_1log__func.html',1,'cv::cudev']]], + ['log_5ffunc_3c_20double_20_3e_376',['log_func< double >',['https://docs.opencv.org/4.2.0/dd/dad/structcv_1_1cudev_1_1log__func_3_01double_01_4.html',1,'cv::cudev']]], + ['log_5ffunc_3c_20float_20_3e_377',['log_func< float >',['https://docs.opencv.org/4.2.0/d2/d85/structcv_1_1cudev_1_1log__func_3_01float_01_4.html',1,'cv::cudev']]], + ['log_5ffunc_3c_20schar_20_3e_378',['log_func< schar >',['https://docs.opencv.org/4.2.0/d2/de1/structcv_1_1cudev_1_1log__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['log_5ffunc_3c_20short_20_3e_379',['log_func< short >',['https://docs.opencv.org/4.2.0/d0/d19/structcv_1_1cudev_1_1log__func_3_01short_01_4.html',1,'cv::cudev']]], + ['log_5ffunc_3c_20uchar_20_3e_380',['log_func< uchar >',['https://docs.opencv.org/4.2.0/d3/db5/structcv_1_1cudev_1_1log__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['log_5ffunc_3c_20uint_20_3e_381',['log_func< uint >',['https://docs.opencv.org/4.2.0/d0/dee/structcv_1_1cudev_1_1log__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['log_5ffunc_3c_20ushort_20_3e_382',['log_func< ushort >',['https://docs.opencv.org/4.2.0/d5/d0c/structcv_1_1cudev_1_1log__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['log_5flevel_5fdebug_383',['LOG_LEVEL_DEBUG',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9a9ddbf3b53deed46c6c946288e9981bac',1,'cv::utils::logging']]], + ['log_5flevel_5ferror_384',['LOG_LEVEL_ERROR',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9ace06c8008d88bf2a2a8f4986667e46ae',1,'cv::utils::logging']]], + ['log_5flevel_5ffatal_385',['LOG_LEVEL_FATAL',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9a575a4dbf4c097783849fbcca720e8a29',1,'cv::utils::logging']]], + ['log_5flevel_5finfo_386',['LOG_LEVEL_INFO',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9a385487d1e9fa9a1619d50c5c5b004feb',1,'cv::utils::logging']]], + ['log_5flevel_5fsilent_387',['LOG_LEVEL_SILENT',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9af22555055cb3ea3e5abe29d84714b7e6',1,'cv::utils::logging']]], + ['log_5flevel_5fverbose_388',['LOG_LEVEL_VERBOSE',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9acdc999c35e205d46f10ac7c15b3b011e',1,'cv::utils::logging']]], + ['log_5flevel_5fwarning_389',['LOG_LEVEL_WARNING',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9a4a4b8775ccf5e8c421aa7c457344b268',1,'cv::utils::logging']]], + ['log_5fwarp_5fsize_390',['LOG_WARP_SIZE',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gga2f3f6453629c910d4743da03f69e0519a2af7ce9904ce49d3a4b05a9b4c5c0d89',1,'cv::cudev::LOG_WARP_SIZE'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gga2f3f6453629c910d4743da03f69e0519a2af7ce9904ce49d3a4b05a9b4c5c0d89',1,'LOG_WARP_SIZE(Global Namespace)']]], + ['logabsdeterminant_391',['logAbsDeterminant',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#afdc29438a335871f67449c253369ce12',1,'Eigen::ColPivHouseholderQR::logAbsDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#afdc29438a335871f67449c253369ce12',1,'ColPivHouseholderQR< MatrixType >::logAbsDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ad59d6dc78dab52a0038ac372b4a72c0d',1,'Eigen::CompleteOrthogonalDecomposition::logAbsDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aafde38918912c9b562f44b0fc3b22589',1,'Eigen::FullPivHouseholderQR::logAbsDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#af61b6dbef34fc51c825182b16dc43ca1',1,'Eigen::HouseholderQR::logAbsDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a7548f80c5cdce49ddc6f994567a26eac',1,'Eigen::SparseLU::logAbsDeterminant()']]], + ['logarithm_20calculation_392',['Natural logarithm calculation',['https://docs.opencv.org/4.2.0/d2/de4/group__core__hal__interface__log.html',1,'']]], + ['logdeterminant_393',['logDeterminant',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a597f7839a39604af18a8741a0d8c46bf',1,'Eigen::CholmodBase::logDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a597f7839a39604af18a8741a0d8c46bf',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::logDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a597f7839a39604af18a8741a0d8c46bf',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::logDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a597f7839a39604af18a8741a0d8c46bf',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::logDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a597f7839a39604af18a8741a0d8c46bf',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::logDeterminant()']]], + ['logger_2edefines_2ehpp_394',['logger.defines.hpp',['https://docs.opencv.org/4.2.0/df/dc4/logger_8defines_8hpp.html',1,'']]], + ['logger_2eh_395',['logger.h',['https://docs.opencv.org/4.2.0/d1/d8c/logger_8h.html',1,'']]], + ['logger_2ehpp_396',['logger.hpp',['https://docs.opencv.org/4.2.0/d6/da3/logger_8hpp.html',1,'']]], + ['logging_20facilities_397',['Logging facilities',['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html',1,'']]], + ['logic_5ferror_398',['logic_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02791.html',1,'std::logic_error'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02791.html#a48e6f223bbd547dcea0d5efdb54b4951',1,'std::logic_error::logic_error()']]], + ['logical_20operations_399',['Bitwise logical operations',['https://docs.opencv.org/4.2.0/d2/d18/group__core__hal__interface__logical.html',1,'']]], + ['logical_5fand_400',['logical_and',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1cudev_1_1logical__and.html',1,'cv::cudev::logical_and< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07531.html',1,'std::logical_and< class >']]], + ['logical_5fand_3c_20void_20_3e_401',['logical_and< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07543.html',1,'std']]], + ['logical_5fnot_402',['logical_not',['https://docs.opencv.org/4.2.0/d4/d01/structcv_1_1cudev_1_1logical__not.html',1,'cv::cudev::logical_not< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07539.html',1,'std::logical_not< class >']]], + ['logical_5fnot_3c_20void_20_3e_403',['logical_not< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07551.html',1,'std']]], + ['logical_5for_404',['logical_or',['https://docs.opencv.org/4.2.0/d3/db2/structcv_1_1cudev_1_1logical__or.html',1,'cv::cudev::logical_or< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07535.html',1,'std::logical_or< class >']]], + ['logical_5for_3c_20void_20_3e_405',['logical_or< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07547.html',1,'std']]], + ['logistic_406',['logistic',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#adb0b668da3480346f2fc81f229b570a6',1,'Eigen']]], + ['logisticregression_407',['LogisticRegression',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html',1,'cv::ml']]], + ['logit_408',['LOGIT',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a22a5db4ceb750ca68782ddb32f44562fafe61aed9caa42c3cc53f3f6f7a09da48',1,'cv::ml::Boost']]], + ['loglevel_409',['LogLevel',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html#a57fad1f723934e699c495e99140f1bd9',1,'cv::utils::logging']]], + ['lognormal_5fdistribution_410',['lognormal_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html',1,'std']]], + ['logpolar_411',['logPolar',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gaec3a0b126a85b5ca2c667b16e0ae022d',1,'cv::logPolar()'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gaec3a0b126a85b5ca2c667b16e0ae022d',1,'logPolar()(Global Namespace)']]], + ['logprocessingtime_412',['logProcessingTime',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aba0b47e6b1371d70beb659fff7f94fe8',1,'cv::videostab::StabilizerBase']]], + ['logsoftmax_413',['logSoftMax',['https://docs.opencv.org/4.2.0/d8/d18/classcv_1_1dnn_1_1SoftmaxLayer.html#aa55c1c0d83caf0946865e225ae37f664',1,'cv::dnn::SoftmaxLayer']]], + ['logstep_414',['logStep',['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a577e7820786e30214651d8a9702fd940',1,'cv::ml::ParamGrid']]], + ['logtag_415',['LogTag',['https://docs.opencv.org/4.2.0/d3/d18/structcv_1_1utils_1_1logging_1_1LogTag.html',1,'cv::utils::logging::LogTag'],['https://docs.opencv.org/4.2.0/d3/d18/structcv_1_1utils_1_1logging_1_1LogTag.html#ae33fa84c80ec7e207da5b15917324ff4',1,'cv::utils::logging::LogTag::LogTag()']]], + ['logtag_2ehpp_416',['logtag.hpp',['https://docs.opencv.org/4.2.0/d5/d77/logtag_8hpp.html',1,'']]], + ['logtagauto_417',['LogTagAuto',['https://docs.opencv.org/4.2.0/d1/df9/structcv_1_1utils_1_1logging_1_1LogTagAuto.html',1,'cv::utils::logging::LogTagAuto'],['https://docs.opencv.org/4.2.0/d1/df9/structcv_1_1utils_1_1logging_1_1LogTagAuto.html#a0254420565bc762a65b1cca8e4cea309',1,'cv::utils::logging::LogTagAuto::LogTagAuto()']]], + ['logtostdout_418',['LogToStdout',['https://docs.opencv.org/4.2.0/d5/de0/classcv_1_1videostab_1_1LogToStdout.html',1,'cv::videostab']]], + ['lon_419',['lon',['../structnavtypes_1_1gpscoords__t.html#aa9695449af42ffbd2732731ccf55644c',1,'navtypes::gpscoords_t']]], + ['lookup_420',['lookup',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#ac32a15d490b1a17dac63556b39d7535e',1,'cv::gapi::GKernelPackage']]], + ['lookup_20tables_20and_20time_20measurement_20with_20opencv_421',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], + ['lookup_5fclassname_422',['lookup_classname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ae475712d0d2b637992cfe799ea83d99c',1,'regex_traits< _CharType >::lookup_classname()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ae475712d0d2b637992cfe799ea83d99c',1,'std::regex_traits::lookup_classname()']]], + ['lookup_5fcollatename_423',['lookup_collatename',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ac1a97012352a2ccef114895cfb08307c',1,'regex_traits< _CharType >::lookup_collatename()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#ac1a97012352a2ccef114895cfb08307c',1,'std::regex_traits::lookup_collatename()']]], + ['lookuptable_424',['LookUpTable',['https://docs.opencv.org/4.2.0/df/d29/classcv_1_1cuda_1_1LookUpTable.html',1,'cv::cuda']]], + ['losertree_2eh_425',['losertree.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00914.html',1,'']]], + ['lost_426',['lost',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a1b6022174f21e52d71e3049539bbf6b4',1,'cv::tbm::Track']]], + ['low_20level_20api_20for_20external_20libraries_20plugins_427',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], + ['lower_428',['Lower',['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cdaf581029282d421eee5aae14238c6f749',1,'Eigen::Lower'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cdaf581029282d421eee5aae14238c6f749',1,'Lower(Global Namespace)']]], + ['lower_5fbound_429',['lower_bound',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#adbb7e90f8d6bece7f9ffb6b76c9ab081',1,'std::map::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a5db81ee7912a625e5d7ead27f0cb4133',1,'std::map::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ab801bf5b252cc1b28af052263ce33d7a',1,'std::map::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a2dfc6f822052135a0b48e0dca314ccaf',1,'std::map::lower_bound(const _Kt &__x) const -> decltype(const_iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#adbb7e90f8d6bece7f9ffb6b76c9ab081',1,'std::map::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a5db81ee7912a625e5d7ead27f0cb4133',1,'std::map::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ab801bf5b252cc1b28af052263ce33d7a',1,'std::map::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a2dfc6f822052135a0b48e0dca314ccaf',1,'std::map::lower_bound(const _Kt &__x) const -> decltype(const_iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad74c803195d97566b7182ad94004068c',1,'std::multimap::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a046e9d0cdebf1e33b637b8d986b1d378',1,'std::multimap::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad125a9ac3189b3dffddd8cbf76e37387',1,'std::multimap::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2ffb43b298f209b70879d8aee8c31fec',1,'std::multimap::lower_bound(const _Kt &__x) const -> decltype(const_iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad74c803195d97566b7182ad94004068c',1,'std::multimap::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a046e9d0cdebf1e33b637b8d986b1d378',1,'std::multimap::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad125a9ac3189b3dffddd8cbf76e37387',1,'std::multimap::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2ffb43b298f209b70879d8aee8c31fec',1,'std::multimap::lower_bound(const _Kt &__x) const -> decltype(const_iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ac76a54ed49d2633b97a71e940461def3',1,'std::multiset::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aa1b1b9236aecf15614ac2f4659edd279',1,'std::multiset::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae1fcdebc244b6b7c006abcc3cb3c63d7',1,'std::multiset::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a9c254b02eb2bdec6f38b12170102b9fd',1,'std::multiset::lower_bound(const _Kt &__x) const -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ac76a54ed49d2633b97a71e940461def3',1,'std::multiset::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aa1b1b9236aecf15614ac2f4659edd279',1,'std::multiset::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae1fcdebc244b6b7c006abcc3cb3c63d7',1,'std::multiset::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a9c254b02eb2bdec6f38b12170102b9fd',1,'std::multiset::lower_bound(const _Kt &__x) const -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ae0623408c438fcbe7426deb496d3fd36',1,'std::set::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#abfcf2991ff3683e095dd11d089e7117c',1,'std::set::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a4ba764c0f23024700dfa99b600909b34',1,'std::set::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a91a143d5a364b10a3a13f6502ef0c23e',1,'std::set::lower_bound(const _Kt &__x) const -> decltype(const_iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ae0623408c438fcbe7426deb496d3fd36',1,'std::set::lower_bound(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#abfcf2991ff3683e095dd11d089e7117c',1,'std::set::lower_bound(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a4ba764c0f23024700dfa99b600909b34',1,'std::set::lower_bound(const _Kt &__x) -> decltype(iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a91a143d5a364b10a3a13f6502ef0c23e',1,'std::set::lower_bound(const _Kt &__x) const -> decltype(const_iterator(_M_t._M_lower_bound_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga6f1d41eed9a1fabbae1d54b384b07061',1,'std::lower_bound(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga80229c3a1e83296551a68c44bda48696',1,'std::lower_bound(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga6f1d41eed9a1fabbae1d54b384b07061',1,'lower_bound(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga80229c3a1e83296551a68c44bda48696',1,'lower_bound(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val, _Compare __comp)(Global Namespace)']]], + ['lowest_430',['lowest',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#aa2bb95f67b879e81fcc80383023eeeb7',1,'std::numeric_limits']]], + ['lpi_431',['lpi',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a45cf9fc1cbb09a4941cdb44fc608cb56',1,'cv::gapi::fluid::Buffer']]], + ['lpmotionstabilizer_432',['LpMotionStabilizer',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html',1,'cv::videostab::LpMotionStabilizer'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#aa24663cfdfb86dc3015f0292854f5f8b',1,'cv::videostab::LpMotionStabilizer::LpMotionStabilizer()']]], + ['lpnorm_433',['lpNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a72586ab059e889e7d2894ff227747e35',1,'Eigen::MatrixBase::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a72586ab059e889e7d2894ff227747e35',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a72586ab059e889e7d2894ff227747e35',1,'MatrixBase< Solve< Decomposition, RhsType > >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'Eigen::VectorwiseOp::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const Derived, Horizontal >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const Derived, Vertical >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::lpNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9c2cad38085e7f5f9bc2598eff249f1',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::lpNorm()']]], + ['lpos_434',['lpos',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a56e2e4fcf08374696d6d99f6173f2081',1,'cv::MatConstIterator']]], + ['lrgb_5fto_5flab4_5f_435',['LRGB_to_Lab4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b6b794439a87c41b2e103e210a0caa4',1,'cv::cudev::LRGB_to_Lab4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b6b794439a87c41b2e103e210a0caa4',1,'LRGB_to_Lab4_()(Global Namespace)']]], + ['lrgb_5fto_5flab4_5ffunc_436',['LRGB_to_Lab4_func',['https://docs.opencv.org/4.2.0/db/d2b/structcv_1_1cudev_1_1LRGB__to__Lab4__func.html',1,'cv::cudev']]], + ['lrgb_5fto_5flab_5f_437',['LRGB_to_Lab_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc6bdde76e9184f83843d48dde22335e',1,'cv::cudev::LRGB_to_Lab_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc6bdde76e9184f83843d48dde22335e',1,'LRGB_to_Lab_()(Global Namespace)']]], + ['lrgb_5fto_5flab_5ffunc_438',['LRGB_to_Lab_func',['https://docs.opencv.org/4.2.0/d6/db7/structcv_1_1cudev_1_1LRGB__to__Lab__func.html',1,'cv::cudev']]], + ['lrgb_5fto_5fluv4_5f_439',['LRGB_to_Luv4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga692b3ec9e0f7ce8f3f7461aa9c794e22',1,'cv::cudev::LRGB_to_Luv4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga692b3ec9e0f7ce8f3f7461aa9c794e22',1,'LRGB_to_Luv4_()(Global Namespace)']]], + ['lrgb_5fto_5fluv4_5ffunc_440',['LRGB_to_Luv4_func',['https://docs.opencv.org/4.2.0/d7/dc8/structcv_1_1cudev_1_1LRGB__to__Luv4__func.html',1,'cv::cudev']]], + ['lrgb_5fto_5fluv_5f_441',['LRGB_to_Luv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30f34fd38b54d01ddb0648938547cd00',1,'cv::cudev::LRGB_to_Luv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30f34fd38b54d01ddb0648938547cd00',1,'LRGB_to_Luv_()(Global Namespace)']]], + ['lrgb_5fto_5fluv_5ffunc_442',['LRGB_to_Luv_func',['https://docs.opencv.org/4.2.0/d7/d62/structcv_1_1cudev_1_1LRGB__to__Luv__func.html',1,'cv::cudev']]], + ['lrgba_5fto_5flab4_5f_443',['LRGBA_to_Lab4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4de453e34af65b3b2b7b93c76f578f6',1,'cv::cudev::LRGBA_to_Lab4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4de453e34af65b3b2b7b93c76f578f6',1,'LRGBA_to_Lab4_()(Global Namespace)']]], + ['lrgba_5fto_5flab4_5ffunc_444',['LRGBA_to_Lab4_func',['https://docs.opencv.org/4.2.0/de/d7f/structcv_1_1cudev_1_1LRGBA__to__Lab4__func.html',1,'cv::cudev']]], + ['lrgba_5fto_5flab_5f_445',['LRGBA_to_Lab_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3864d44505667227680474b013de3500',1,'cv::cudev::LRGBA_to_Lab_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3864d44505667227680474b013de3500',1,'LRGBA_to_Lab_()(Global Namespace)']]], + ['lrgba_5fto_5flab_5ffunc_446',['LRGBA_to_Lab_func',['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1cudev_1_1LRGBA__to__Lab__func.html',1,'cv::cudev']]], + ['lrgba_5fto_5fluv4_5f_447',['LRGBA_to_Luv4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a03f510311fa9c0b4dc5c4a05788942',1,'cv::cudev::LRGBA_to_Luv4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a03f510311fa9c0b4dc5c4a05788942',1,'LRGBA_to_Luv4_()(Global Namespace)']]], + ['lrgba_5fto_5fluv4_5ffunc_448',['LRGBA_to_Luv4_func',['https://docs.opencv.org/4.2.0/dd/dea/structcv_1_1cudev_1_1LRGBA__to__Luv4__func.html',1,'cv::cudev']]], + ['lrgba_5fto_5fluv_5f_449',['LRGBA_to_Luv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a50c681001f8ce0aa0c884e06392a04',1,'cv::cudev::LRGBA_to_Luv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a50c681001f8ce0aa0c884e06392a04',1,'LRGBA_to_Luv_()(Global Namespace)']]], + ['lrgba_5fto_5fluv_5ffunc_450',['LRGBA_to_Luv_func',['https://docs.opencv.org/4.2.0/d2/d19/structcv_1_1cudev_1_1LRGBA__to__Luv__func.html',1,'cv::cudev']]], + ['lrnlayer_451',['LRNLayer',['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html',1,'cv::dnn']]], + ['lsbp_5fcamera_5fmotion_5fcompensation_5flk_452',['LSBP_CAMERA_MOTION_COMPENSATION_LK',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gga1a5838fa2d2697ac455b136bfcdb4600ad8f108b7815d6bcccd32b849063e0a9c',1,'cv::bgsegm::LSBP_CAMERA_MOTION_COMPENSATION_LK'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gga1a5838fa2d2697ac455b136bfcdb4600ad8f108b7815d6bcccd32b849063e0a9c',1,'LSBP_CAMERA_MOTION_COMPENSATION_LK(Global Namespace)']]], + ['lsbp_5fcamera_5fmotion_5fcompensation_5fnone_453',['LSBP_CAMERA_MOTION_COMPENSATION_NONE',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gga1a5838fa2d2697ac455b136bfcdb4600a5851b7a8bd9c7cec7006e8c619122f3c',1,'cv::bgsegm::LSBP_CAMERA_MOTION_COMPENSATION_NONE'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gga1a5838fa2d2697ac455b136bfcdb4600a5851b7a8bd9c7cec7006e8c619122f3c',1,'LSBP_CAMERA_MOTION_COMPENSATION_NONE(Global Namespace)']]], + ['lsbpcameramotioncompensation_454',['LSBPCameraMotionCompensation',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga1a5838fa2d2697ac455b136bfcdb4600',1,'cv::bgsegm::LSBPCameraMotionCompensation'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga1a5838fa2d2697ac455b136bfcdb4600',1,'LSBPCameraMotionCompensation(Global Namespace)']]], + ['lsc_2ehpp_455',['lsc.hpp',['https://docs.opencv.org/4.2.0/da/d29/lsc_8hpp.html',1,'']]], + ['lsd_5frefine_5fadv_456',['LSD_REFINE_ADV',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ggad092a7362b8afb8a905238a41898d98ca88d573b707a6f7bbdeae166247cd8c15',1,'cv::LSD_REFINE_ADV'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ggad092a7362b8afb8a905238a41898d98ca88d573b707a6f7bbdeae166247cd8c15',1,'LSD_REFINE_ADV(Global Namespace)']]], + ['lsd_5frefine_5fnone_457',['LSD_REFINE_NONE',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ggad092a7362b8afb8a905238a41898d98ca0114485ddcbb3d913b6d899a8697e30e',1,'cv::LSD_REFINE_NONE'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ggad092a7362b8afb8a905238a41898d98ca0114485ddcbb3d913b6d899a8697e30e',1,'LSD_REFINE_NONE(Global Namespace)']]], + ['lsd_5frefine_5fstd_458',['LSD_REFINE_STD',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ggad092a7362b8afb8a905238a41898d98cade4b0da3a52bc9765f08255f041facb4',1,'cv::LSD_REFINE_STD'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ggad092a7362b8afb8a905238a41898d98cade4b0da3a52bc9765f08255f041facb4',1,'LSD_REFINE_STD(Global Namespace)']]], + ['lsddetector_459',['LSDDetector',['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html',1,'cv::line_descriptor::LSDDetector'],['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#a2a4e6484d35ea1a16cd89cf06bab6aef',1,'cv::line_descriptor::LSDDetector::LSDDetector()'],['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#a4f10b3e3cddf8c4f9ed306af8f7f621f',1,'cv::line_descriptor::LSDDetector::LSDDetector(LSDParam _params)']]], + ['lsdparam_460',['LSDParam',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html',1,'cv::line_descriptor::LSDParam'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#ab9ed5e6e4d8b3d10a547e5c58d4a7545',1,'cv::line_descriptor::LSDParam::LSDParam()']]], + ['lsh_5findex_2eh_461',['lsh_index.h',['https://docs.opencv.org/4.2.0/dd/d79/lsh__index_8h.html',1,'']]], + ['lsh_5ftable_2eh_462',['lsh_table.h',['https://docs.opencv.org/4.2.0/d6/db3/lsh__table_8h.html',1,'']]], + ['lshift_463',['lshift',['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gafd072accecb14c9adccdad45e3bf2300',1,'cv::cuda::lshift()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gafd072accecb14c9adccdad45e3bf2300',1,'lshift()(Global Namespace)']]], + ['lstmlayer_464',['LSTMLayer',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html',1,'cv::dnn']]], + ['lt_465',['lt',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#a0c3534c983a8be0b4416c458a920aeec',1,'cv::gapi::wip::draw::Circle::lt'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#ae6a8f0ba84f674f9c3fdf87f3d2107f0',1,'cv::gapi::wip::draw::Line::lt'],['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#af0f7ecd2e8b4098625a193b9676b6bdd',1,'cv::gapi::wip::draw::Poly::lt'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html#ae10a93a9f5924b64fcca832b0c7ca04e',1,'cv::gapi::wip::draw::Rect::lt'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a688d93708a9c11ff5582b64484dcd334',1,'cv::gapi::wip::draw::Text::lt']]], + ['lu_466',['LU',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6caa4b9c6213b619c6e6f7523dc520fb',1,'cv::LU(float *A, size_t astep, int m, float *b, size_t bstep, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf80b646047515ac185536d342f3219a5',1,'cv::LU(double *A, size_t astep, int m, double *b, size_t bstep, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6caa4b9c6213b619c6e6f7523dc520fb',1,'LU(float *A, size_t astep, int m, float *b, size_t bstep, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf80b646047515ac185536d342f3219a5',1,'LU(double *A, size_t astep, int m, double *b, size_t bstep, int n)(Global Namespace)']]], + ['lu_467',['lu',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb312afbfe960cbda67811552d876fae',1,'Eigen::MatrixBase::lu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb312afbfe960cbda67811552d876fae',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::lu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb312afbfe960cbda67811552d876fae',1,'MatrixBase< Solve< Decomposition, RhsType > >::lu()']]], + ['lu_20matrix_20decomposition_468',['LU matrix decomposition',['https://docs.opencv.org/4.2.0/d5/d42/group__core__hal__interface__decomp__lu.html',1,'']]], + ['lu_20module_469',['LU module',['https://eigen.tuxfamily.org/dox/group__LU__Module.html',1,'']]], + ['lu32f_470',['LU32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfb1d2c42a8292dd0f9bb63abd2c0d41',1,'cv::hal::LU32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfb1d2c42a8292dd0f9bb63abd2c0d41',1,'LU32f()(Global Namespace)']]], + ['lu64f_471',['LU64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga96b03c679e27c7cf3ec17823db7b260d',1,'cv::hal::LU64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga96b03c679e27c7cf3ec17823db7b260d',1,'LU64f()(Global Namespace)']]], + ['lu_5fcounter_5fmetadata_472',['lu_counter_metadata',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11855.html',1,'__gnu_pbds::detail']]], + ['lu_5fcounter_5fmetadata_2ehpp_473',['lu_counter_metadata.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01361.html',1,'']]], + ['lu_5fcounter_5fpolicy_474',['lu_counter_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html',1,'__gnu_pbds']]], + ['lu_5fcounter_5fpolicy_5fbase_475',['lu_counter_policy_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11851.html',1,'__gnu_pbds::detail']]], + ['lu_5fcounter_5fpolicy_5fbase_3c_20_5falloc_3a_3asize_5ftype_20_3e_476',['lu_counter_policy_base< _Alloc::size_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11851.html',1,'']]], + ['lu_5fmap_477',['lu_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11827.html',1,'__gnu_pbds::detail']]], + ['lu_5fmap_5f_2ehpp_478',['lu_map_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01358.html',1,'']]], + ['lu_5fmove_5fto_5ffront_5fpolicy_479',['lu_move_to_front_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html',1,'__gnu_pbds']]], + ['lucid_480',['LUCID',['https://docs.opencv.org/4.2.0/d4/d86/classcv_1_1xfeatures2d_1_1LUCID.html',1,'cv::xfeatures2d']]], + ['lut_481',['LUT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab55b8d062b7f5587720ede032d34156f',1,'cv::LUT()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga7f13dbe65b7df6816c53162647762a11',1,'cv::gapi::LUT()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab55b8d062b7f5587720ede032d34156f',1,'LUT(InputArray src, InputArray lut, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga7f13dbe65b7df6816c53162647762a11',1,'LUT(const GMat &src, const Mat &lut)(Global Namespace)']]], + ['lut_2ehpp_482',['lut.hpp',['https://docs.opencv.org/4.2.0/d7/d32/lut_8hpp.html',1,'']]], + ['lut_5f_483',['lut_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a31ed286e5a9ec9e6a59e27eed4c85b',1,'cv::cudev::lut_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a31ed286e5a9ec9e6a59e27eed4c85b',1,'lut_()(Global Namespace)']]], + ['lutptr_484',['LutPtr',['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html',1,'cv::cudev']]], + ['lutptr_485',['lutPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd4c67c9f95732b8b985d6e9ff086c64',1,'cv::cudev::lutPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd4c67c9f95732b8b985d6e9ff086c64',1,'lutPtr()(Global Namespace)']]], + ['lutptrsz_486',['LutPtrSz',['https://docs.opencv.org/4.2.0/d5/d22/structcv_1_1cudev_1_1LutPtrSz.html',1,'cv::cudev']]], + ['luv2bgr_487',['LUV2BGR',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#gad83380f5b614aebd9430c09800e12849',1,'cv::gapi::LUV2BGR()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#gad83380f5b614aebd9430c09800e12849',1,'LUV2BGR()(Global Namespace)']]], + ['luv2rgb_488',['Luv2RGB',['https://docs.opencv.org/4.2.0/d6/d2a/classcv_1_1cudev_1_1color__cvt__detail_1_1Luv2RGB.html',1,'cv::cudev::color_cvt_detail']]], + ['luv4_5fto_5fbgr_5f_489',['Luv4_to_BGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf80fef715daf5b36e6ad49fcdbfa7c3d',1,'cv::cudev::Luv4_to_BGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf80fef715daf5b36e6ad49fcdbfa7c3d',1,'Luv4_to_BGR_()(Global Namespace)']]], + ['luv4_5fto_5fbgr_5ffunc_490',['Luv4_to_BGR_func',['https://docs.opencv.org/4.2.0/d5/d34/structcv_1_1cudev_1_1Luv4__to__BGR__func.html',1,'cv::cudev']]], + ['luv4_5fto_5fbgra_5f_491',['Luv4_to_BGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91f9613961b60293fb8eb404141edcb4',1,'cv::cudev::Luv4_to_BGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91f9613961b60293fb8eb404141edcb4',1,'Luv4_to_BGRA_()(Global Namespace)']]], + ['luv4_5fto_5fbgra_5ffunc_492',['Luv4_to_BGRA_func',['https://docs.opencv.org/4.2.0/d4/d0b/structcv_1_1cudev_1_1Luv4__to__BGRA__func.html',1,'cv::cudev']]], + ['luv4_5fto_5flbgr_5f_493',['Luv4_to_LBGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f9f5f45f121f25eb86134f913d0e6e',1,'cv::cudev::Luv4_to_LBGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f9f5f45f121f25eb86134f913d0e6e',1,'Luv4_to_LBGR_()(Global Namespace)']]], + ['luv4_5fto_5flbgr_5ffunc_494',['Luv4_to_LBGR_func',['https://docs.opencv.org/4.2.0/d6/d9a/structcv_1_1cudev_1_1Luv4__to__LBGR__func.html',1,'cv::cudev']]], + ['luv4_5fto_5flbgra_5f_495',['Luv4_to_LBGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8483aba33f1908ede7e55dcdccaa8a30',1,'cv::cudev::Luv4_to_LBGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8483aba33f1908ede7e55dcdccaa8a30',1,'Luv4_to_LBGRA_()(Global Namespace)']]], + ['luv4_5fto_5flbgra_5ffunc_496',['Luv4_to_LBGRA_func',['https://docs.opencv.org/4.2.0/df/d46/structcv_1_1cudev_1_1Luv4__to__LBGRA__func.html',1,'cv::cudev']]], + ['luv4_5fto_5flrgb_5f_497',['Luv4_to_LRGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf01d4bcca087a03a65d2ea3a4bbaeb0',1,'cv::cudev::Luv4_to_LRGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf01d4bcca087a03a65d2ea3a4bbaeb0',1,'Luv4_to_LRGB_()(Global Namespace)']]], + ['luv4_5fto_5flrgb_5ffunc_498',['Luv4_to_LRGB_func',['https://docs.opencv.org/4.2.0/d8/db0/structcv_1_1cudev_1_1Luv4__to__LRGB__func.html',1,'cv::cudev']]], + ['luv4_5fto_5flrgba_5f_499',['Luv4_to_LRGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c6e2c35503c364b883801bb953ba534',1,'cv::cudev::Luv4_to_LRGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c6e2c35503c364b883801bb953ba534',1,'Luv4_to_LRGBA_()(Global Namespace)']]], + ['luv4_5fto_5flrgba_5ffunc_500',['Luv4_to_LRGBA_func',['https://docs.opencv.org/4.2.0/d2/dc0/structcv_1_1cudev_1_1Luv4__to__LRGBA__func.html',1,'cv::cudev']]], + ['luv4_5fto_5frgb_5f_501',['Luv4_to_RGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga924358ec8a5e9d90292661d096549b19',1,'cv::cudev::Luv4_to_RGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga924358ec8a5e9d90292661d096549b19',1,'Luv4_to_RGB_()(Global Namespace)']]], + ['luv4_5fto_5frgb_5ffunc_502',['Luv4_to_RGB_func',['https://docs.opencv.org/4.2.0/de/d9f/structcv_1_1cudev_1_1Luv4__to__RGB__func.html',1,'cv::cudev']]], + ['luv4_5fto_5frgba_5f_503',['Luv4_to_RGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9081941871dce5ced62c38bbf05307c9',1,'cv::cudev::Luv4_to_RGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9081941871dce5ced62c38bbf05307c9',1,'Luv4_to_RGBA_()(Global Namespace)']]], + ['luv4_5fto_5frgba_5ffunc_504',['Luv4_to_RGBA_func',['https://docs.opencv.org/4.2.0/d2/dda/structcv_1_1cudev_1_1Luv4__to__RGBA__func.html',1,'cv::cudev']]], + ['luv_5fto_5fbgr_5f_505',['Luv_to_BGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8a0199c0b26adeb2d600778eba84190',1,'cv::cudev::Luv_to_BGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8a0199c0b26adeb2d600778eba84190',1,'Luv_to_BGR_()(Global Namespace)']]], + ['luv_5fto_5fbgr_5ffunc_506',['Luv_to_BGR_func',['https://docs.opencv.org/4.2.0/d2/da9/structcv_1_1cudev_1_1Luv__to__BGR__func.html',1,'cv::cudev']]], + ['luv_5fto_5fbgra_5f_507',['Luv_to_BGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga275c3ff3d8e27c8fc6fd7d1b40b52d75',1,'cv::cudev::Luv_to_BGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga275c3ff3d8e27c8fc6fd7d1b40b52d75',1,'Luv_to_BGRA_()(Global Namespace)']]], + ['luv_5fto_5fbgra_5ffunc_508',['Luv_to_BGRA_func',['https://docs.opencv.org/4.2.0/df/d49/structcv_1_1cudev_1_1Luv__to__BGRA__func.html',1,'cv::cudev']]], + ['luv_5fto_5flbgr_5f_509',['Luv_to_LBGR_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d4dec5e16d429550b7162afb1ceb18e',1,'cv::cudev::Luv_to_LBGR_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d4dec5e16d429550b7162afb1ceb18e',1,'Luv_to_LBGR_()(Global Namespace)']]], + ['luv_5fto_5flbgr_5ffunc_510',['Luv_to_LBGR_func',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1cudev_1_1Luv__to__LBGR__func.html',1,'cv::cudev']]], + ['luv_5fto_5flbgra_5f_511',['Luv_to_LBGRA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga655159f0bbf0a2d396aa3a862e4b9d5f',1,'cv::cudev::Luv_to_LBGRA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga655159f0bbf0a2d396aa3a862e4b9d5f',1,'Luv_to_LBGRA_()(Global Namespace)']]], + ['luv_5fto_5flbgra_5ffunc_512',['Luv_to_LBGRA_func',['https://docs.opencv.org/4.2.0/d0/da4/structcv_1_1cudev_1_1Luv__to__LBGRA__func.html',1,'cv::cudev']]], + ['luv_5fto_5flrgb_5f_513',['Luv_to_LRGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bd1e9fccd4732b0cacf5820be9e005c',1,'cv::cudev::Luv_to_LRGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bd1e9fccd4732b0cacf5820be9e005c',1,'Luv_to_LRGB_()(Global Namespace)']]], + ['luv_5fto_5flrgb_5ffunc_514',['Luv_to_LRGB_func',['https://docs.opencv.org/4.2.0/d7/d11/structcv_1_1cudev_1_1Luv__to__LRGB__func.html',1,'cv::cudev']]], + ['luv_5fto_5flrgba_5f_515',['Luv_to_LRGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6d1647bd0cb36dd68655af2486f7964',1,'cv::cudev::Luv_to_LRGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6d1647bd0cb36dd68655af2486f7964',1,'Luv_to_LRGBA_()(Global Namespace)']]], + ['luv_5fto_5flrgba_5ffunc_516',['Luv_to_LRGBA_func',['https://docs.opencv.org/4.2.0/d0/d32/structcv_1_1cudev_1_1Luv__to__LRGBA__func.html',1,'cv::cudev']]], + ['luv_5fto_5frgb_5f_517',['Luv_to_RGB_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga498d2783c4cca8d8ddb9b0d6936ab468',1,'cv::cudev::Luv_to_RGB_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga498d2783c4cca8d8ddb9b0d6936ab468',1,'Luv_to_RGB_()(Global Namespace)']]], + ['luv_5fto_5frgb_5ffunc_518',['Luv_to_RGB_func',['https://docs.opencv.org/4.2.0/d4/d45/structcv_1_1cudev_1_1Luv__to__RGB__func.html',1,'cv::cudev']]], + ['luv_5fto_5frgba_5f_519',['Luv_to_RGBA_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a989abde2212a2d09bb6890f6ea2c78',1,'cv::cudev::Luv_to_RGBA_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a989abde2212a2d09bb6890f6ea2c78',1,'Luv_to_RGBA_()(Global Namespace)']]], + ['luv_5fto_5frgba_5ffunc_520',['Luv_to_RGBA_func',['https://docs.opencv.org/4.2.0/d8/d1e/structcv_1_1cudev_1_1Luv__to__RGBA__func.html',1,'cv::cudev']]], + ['lvaluebit_521',['LvalueBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gae2c323957f20dfdc6cb8f44428eaec1a',1,'Eigen::LvalueBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gae2c323957f20dfdc6cb8f44428eaec1a',1,'LvalueBit(Global Namespace)']]] ]; diff --git a/search/all_16.js b/search/all_16.js index 4247c0a3..1173f86c 100644 --- a/search/all_16.js +++ b/search/all_16.js @@ -163,947 +163,942 @@ var searchData= ['manipulation_160',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], ['manipulation_20via_20nullary_20expressions_161',['Matrix manipulation via nullary-expressions',['https://eigen.tuxfamily.org/dox/TopicCustomizing_NullaryExpr.html',1,'']]], ['manipulations_162',['Sparse matrix manipulations',['https://eigen.tuxfamily.org/dox/group__TutorialSparse.html',1,'']]], - ['map_163',['Map',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html',1,'cv::reg::Map'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'Eigen::Map< class, MapOptions, class >']]], - ['map_164',['map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08727.html',1,'std::__debug::map< _Key, _Tp, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08923.html',1,'std::__profile::map< _Key, _Tp, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html',1,'std::map< _Key, _Tp, _Compare, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00104.html',1,'(Global Namespace)']]], - ['map_165',['Map',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Eigen::Map::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Eigen::Map::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Eigen::Map::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Derived, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Derived, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Derived, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Derived, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Derived, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Derived, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01const_01Quaternion_3_01__Scalar_01_4_00_01__Options_01_4.html#a62785b607c1f24dfc042e28dedc791f8',1,'Eigen::Map< const Quaternion< _Scalar >, _Options >::Map()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01Quaternion_3_01__Scalar_01_4_00_01__Options_01_4.html#a225f365e99258e028ef1ffa0031fab9b',1,'Eigen::Map< Quaternion< _Scalar >, _Options >::Map()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< SparseMatrix< _Scalar, _Flags, _StorageIndex > >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< SparseMatrix< _Scalar, _Flags, _StorageIndex > >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< SparseMatrix< _Scalar, _Flags, _StorageIndex > >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< SparseMatrix< Scalar, _Flags, StorageIndex > >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< SparseMatrix< Scalar, _Flags, StorageIndex > >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< SparseMatrix< Scalar, _Flags, StorageIndex > >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01SparseMatrixType_01_4.html#a3afd7ca5fb61494e9195a1e318078028',1,'Eigen::Map< SparseMatrixType >::Map(Index rows, Index cols, Index nnz, const StorageIndex *outerIndexPtr, const StorageIndex *innerIndexPtr, const Scalar *valuePtr, const StorageIndex *innerNonZerosPtr=0)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01SparseMatrixType_01_4.html#aeecd1e0e97eeae254ad97cdf5bde9ec2',1,'Eigen::Map< SparseMatrixType >::Map(Index rows, Index cols, Index nnz, StorageIndex *outerIndexPtr, StorageIndex *innerIndexPtr, Scalar *valuePtr, StorageIndex *innerNonZerosPtr=0)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'Eigen::PlainObjectBase::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'Eigen::PlainObjectBase::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'Eigen::PlainObjectBase::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'Eigen::PlainObjectBase::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'Eigen::PlainObjectBase::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'Eigen::PlainObjectBase::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'Eigen::PlainObjectBase::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'Eigen::PlainObjectBase::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'Eigen::PlainObjectBase::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'Eigen::PlainObjectBase::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'Eigen::PlainObjectBase::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'Eigen::PlainObjectBase::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)']]], - ['map_166',['MAP',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a046708f7941fcfe57adab07734a605a0',1,'cv::FileNode']]], - ['map_167',['map',['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html#a98faf5405ad3fb727f5205e4c2d7bf58',1,'cv::cudev::RemapPtr1::map'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#ad56f6160283a96780a3d02bc34595151',1,'cv::MatAllocator::map()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#afc7cdce90f8100d9bf741d33f2b50019',1,'std::map::map()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#aa12fa7df574ac42da454cba7581c258e',1,'std::map::map(const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a8710ed019be6e93c3e226853e91da124',1,'std::map::map(const map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a3f71fbbe2f15bf4a55f383030fe7d72f',1,'std::map::map(map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a353d38055f6c80e99c699ee4eeec914e',1,'std::map::map(initializer_list< value_type > __l, const _Compare &__comp=_Compare(), const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a97d93d27671323c77e27ef2986a4bcb8',1,'std::map::map(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ae74f7651afbcb8b1c2d491a7145f3313',1,'std::map::map(const map &__m, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a95c130beb22f45766110a5b734a5b7a6',1,'std::map::map(map &&__m, const allocator_type &__a) noexcept(is_nothrow_copy_constructible< _Compare >::value &&_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a8310f2293e381afba51e9cc44dd0eeef',1,'std::map::map(initializer_list< value_type > __l, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a0d2b5c52350b2b79506ab308b32ca5f1',1,'std::map::map(_InputIterator __first, _InputIterator __last, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a6339535802f1937f3dd78ee04d950ea7',1,'std::map::map(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ac30882bd54277810ace3d0630cbc3252',1,'std::map::map(_InputIterator __first, _InputIterator __last, const _Compare &__comp, const allocator_type &__a=allocator_type())']]], - ['map_20class_168',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], - ['map_20from_20stereo_20images_169',['Depth Map from Stereo Images',['https://docs.opencv.org/4.2.0/dd/d53/tutorial_py_depthmap.html',1,'']]], - ['map_20post_20filtering_170',['Disparity map post-filtering',['https://docs.opencv.org/4.2.0/d3/d14/tutorial_ximgproc_disparity_filtering.html',1,'']]], - ['map_2ehpp_171',['map.hpp',['https://docs.opencv.org/4.2.0/df/d7c/map_8hpp.html',1,'']]], - ['map_3c_20const_20array_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_172',['Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20array_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_173',['Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20array_3c_20double_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_174',['Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20array_3c_20double_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_175',['Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20array_3c_20index_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_176',['Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20array_3c_20index_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_177',['Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20array_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_178',['Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20array_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_179',['Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20array_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_180',['Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20array_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_181',['Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20array_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_182',['Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20array_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_183',['Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20derived_2c_20alignedmax_20_3e_184',['Map< const Derived, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20derived_2c_20unaligned_20_3e_185',['Map< const Derived, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20matrix_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_186',['Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20matrix_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_187',['Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20matrix_3c_20complexscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_188',['Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20matrix_3c_20complexscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_189',['Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20matrix_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_190',['Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20matrix_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_191',['Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20matrix_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_192',['Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20matrix_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_193',['Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20matrix_3c_20scalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_194',['Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20matrix_3c_20scalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_195',['Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20matrix_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_196',['Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20matrix_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_197',['Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20const_20quaternion_3c_20_5fscalar_20_3e_2c_20_5foptions_20_3e_198',['Map< const Quaternion< _Scalar >, _Options >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01const_01Quaternion_3_01__Scalar_01_4_00_01__Options_01_4.html',1,'Eigen']]], - ['map_3c_20int_2c_20string_20_3e_199',['map< int, String >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html',1,'std']]], - ['map_3c_20quaternion_3c_20_5fscalar_20_3e_2c_20_5foptions_20_3e_200',['Map< Quaternion< _Scalar >, _Options >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01Quaternion_3_01__Scalar_01_4_00_01__Options_01_4.html',1,'Eigen']]], - ['map_3c_20sparsematrix_3c_20_5fscalar_2c_20_5fflags_2c_20_5fstorageindex_20_3e_20_3e_201',['Map< SparseMatrix< _Scalar, _Flags, _StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20sparsematrix_3c_20scalar_2c_20_5fflags_2c_20storageindex_20_3e_20_3e_202',['Map< SparseMatrix< Scalar, _Flags, StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], - ['map_3c_20sparsematrixtype_20_3e_203',['Map< SparseMatrixType >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01SparseMatrixType_01_4.html',1,'Eigen']]], - ['map_3c_20std_3a_3astring_2c_20msghandler_5ft_20_3e_204',['map< std::string, msghandler_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html',1,'std']]], - ['map_3c_20std_3a_3astring_2c_20protocoldata_20_3e_205',['map< std::string, ProtocolData >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html',1,'std']]], - ['map_3c_20std_3a_3astring_2c_20validator_5ft_20_3e_206',['map< std::string, validator_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html',1,'std']]], - ['map_3c_20string_2c_20std_3a_3avector_3c_20templatepyramid_20_3e_20_3e_207',['map< String, std::vector< TemplatePyramid > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html',1,'std']]], - ['mapaffine_208',['MapAffine',['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html',1,'cv::reg::MapAffine'],['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#acc52d4c3904bea5a600636512c1fd698',1,'cv::reg::MapAffine::MapAffine()'],['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#a523a626ee780193528933037bab58342',1,'cv::reg::MapAffine::MapAffine(InputArray linTr, InputArray shift)']]], - ['mapaffine_2ehpp_209',['mapaffine.hpp',['https://docs.opencv.org/4.2.0/dd/d7f/mapaffine_8hpp.html',1,'']]], - ['mapaligned_210',['MapAligned',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'Eigen::PlainObjectBase::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'Eigen::PlainObjectBase::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'Eigen::PlainObjectBase::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'Eigen::PlainObjectBase::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'Eigen::PlainObjectBase::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'Eigen::PlainObjectBase::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'Eigen::PlainObjectBase::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'Eigen::PlainObjectBase::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'Eigen::PlainObjectBase::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'Eigen::PlainObjectBase::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'Eigen::PlainObjectBase::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'Eigen::PlainObjectBase::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)']]], - ['mapbackward_211',['mapBackward',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1detail_1_1CompressedRectilinearPortraitProjector.html#ac1326980813ddf21bae2576d8d6e2433',1,'cv::detail::CompressedRectilinearPortraitProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/db/dbb/structcv_1_1detail_1_1CompressedRectilinearProjector.html#a7f8cf7e90aa0d6719594e41e63c2b8f8',1,'cv::detail::CompressedRectilinearProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/df/d3f/structcv_1_1detail_1_1CylindricalPortraitProjector.html#ad2be06ada62e1113cb96327878d5a9a3',1,'cv::detail::CylindricalPortraitProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/dd/d96/structcv_1_1detail_1_1CylindricalProjector.html#afc8c891de72749c116eaae61ee5b0db3',1,'cv::detail::CylindricalProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d9/de9/structcv_1_1detail_1_1FisheyeProjector.html#a81b6f2d6e85590b0f06c51ca574184f3',1,'cv::detail::FisheyeProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d1/daa/structcv_1_1detail_1_1MercatorProjector.html#a2cd004542503dee227d1b0780972e6fe',1,'cv::detail::MercatorProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d3/dd1/structcv_1_1detail_1_1PaniniPortraitProjector.html#a0691319e5e53456a071fb5f00b2cd5f8',1,'cv::detail::PaniniPortraitProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d2/df1/structcv_1_1detail_1_1PaniniProjector.html#a022e808732ab79aa9e3d68e7a59125e4',1,'cv::detail::PaniniProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/df/d0d/structcv_1_1detail_1_1PlanePortraitProjector.html#aa84e0cde84ad602aff3caa7b0218b22a',1,'cv::detail::PlanePortraitProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d6/d1f/structcv_1_1detail_1_1PlaneProjector.html#ad6d194bbbee2fe09bf3c20682dee8754',1,'cv::detail::PlaneProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d3/d0d/structcv_1_1detail_1_1SphericalPortraitProjector.html#abecd1908bed4ca2f186cc85a3d581a19',1,'cv::detail::SphericalPortraitProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d0/d88/structcv_1_1detail_1_1SphericalProjector.html#a99e8bcc78ff64a99d9917e597ff3b688',1,'cv::detail::SphericalProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d0/ddf/structcv_1_1detail_1_1StereographicProjector.html#a9562e305667375c9155c22e7ead7c1cc',1,'cv::detail::StereographicProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d5/df7/structcv_1_1detail_1_1TransverseMercatorProjector.html#ab92befd6f93310e7490f0a57065a0e00',1,'cv::detail::TransverseMercatorProjector::mapBackward()']]], - ['mapbase_3c_20derived_2c_20readonlyaccessors_20_3e_212',['MapBase< Derived, ReadOnlyAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html',1,'Eigen']]], - ['mapbase_3c_20derived_2c_20writeaccessors_20_3e_213',['MapBase< Derived, WriteAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01WriteAccessors_01_4.html',1,'Eigen']]], - ['mapcount_214',['mapcount',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a962745e56207df9044692e6fa0617f57',1,'cv::UMatData']]], - ['mapdevice_215',['mapDevice',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a57864bec2d9dbef4edf25ea018db71d9',1,'cv::ogl::Buffer::mapDevice()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#abde1b6c518abefeee7cf878b066c65fb',1,'cv::ogl::Buffer::mapDevice(cuda::Stream &stream)']]], - ['mapforward_216',['mapForward',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1detail_1_1CompressedRectilinearPortraitProjector.html#aed4225e50d87676a9b73b1f46a277840',1,'cv::detail::CompressedRectilinearPortraitProjector::mapForward()'],['https://docs.opencv.org/4.2.0/db/dbb/structcv_1_1detail_1_1CompressedRectilinearProjector.html#aa84e919cc3041a43d790d163dee1c741',1,'cv::detail::CompressedRectilinearProjector::mapForward()'],['https://docs.opencv.org/4.2.0/df/d3f/structcv_1_1detail_1_1CylindricalPortraitProjector.html#a1a3a245fab74ae18a740074c1bdd57f8',1,'cv::detail::CylindricalPortraitProjector::mapForward()'],['https://docs.opencv.org/4.2.0/dd/d96/structcv_1_1detail_1_1CylindricalProjector.html#a76dac015854f097514c56afc13c95b7f',1,'cv::detail::CylindricalProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d9/de9/structcv_1_1detail_1_1FisheyeProjector.html#ae06aa70c6db995a2dc274b4275739db8',1,'cv::detail::FisheyeProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d1/daa/structcv_1_1detail_1_1MercatorProjector.html#ac6921255985a3f53445a8e1298f31740',1,'cv::detail::MercatorProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d3/dd1/structcv_1_1detail_1_1PaniniPortraitProjector.html#a3d0fc546b0f911b64b3c6b5613f82da1',1,'cv::detail::PaniniPortraitProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d2/df1/structcv_1_1detail_1_1PaniniProjector.html#a7781618e07c1541b9e291ce2e31b6b45',1,'cv::detail::PaniniProjector::mapForward()'],['https://docs.opencv.org/4.2.0/df/d0d/structcv_1_1detail_1_1PlanePortraitProjector.html#a7fdf2c51b4344000e0e2c40065df047a',1,'cv::detail::PlanePortraitProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d6/d1f/structcv_1_1detail_1_1PlaneProjector.html#a2d061a4c6b28430dbae9db5058b22e04',1,'cv::detail::PlaneProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d3/d0d/structcv_1_1detail_1_1SphericalPortraitProjector.html#ac095f1b9c9ad5fdcfdc00bc4a4192b98',1,'cv::detail::SphericalPortraitProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d0/d88/structcv_1_1detail_1_1SphericalProjector.html#ac272e6dfbc3c88372d7d65b03fcd512b',1,'cv::detail::SphericalProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d0/ddf/structcv_1_1detail_1_1StereographicProjector.html#a52f631c7449a1ae19640bad757942e0f',1,'cv::detail::StereographicProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d5/df7/structcv_1_1detail_1_1TransverseMercatorProjector.html#a2f235d23845e2cd796d8369eda374de0',1,'cv::detail::TransverseMercatorProjector::mapForward()']]], - ['mapglbuffer_217',['mapGLBuffer',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga39ac62ef00a590b9021e233d1dcdc622',1,'cv::ogl::mapGLBuffer()'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga39ac62ef00a590b9021e233d1dcdc622',1,'mapGLBuffer()(Global Namespace)']]], - ['maphost_218',['mapHost',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a3e14b8b56c501c5c90c79aca9c744d18',1,'cv::ogl::Buffer']]], - ['mapped_5ftype_219',['mapped_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6d830d6d91653672a6f20b748327622b',1,'std::unordered_map::mapped_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6d830d6d91653672a6f20b748327622b',1,'std::unordered_map::mapped_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a3e1544ab885cd443cf557eb35db830e8',1,'std::unordered_multimap::mapped_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a3e1544ab885cd443cf557eb35db830e8',1,'std::unordered_multimap::mapped_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6d830d6d91653672a6f20b748327622b',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::mapped_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6d830d6d91653672a6f20b748327622b',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::mapped_type'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a1c9c1509ee714a9814b45a8030c84ec7.html#a1c9c1509ee714a9814b45a8030c84ec7',1,'nlohmann::ordered_map::mapped_type']]], - ['mappedsparsematrix_220',['MappedSparseMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1MappedSparseMatrix.html',1,'Eigen']]], - ['mappedsparsematrix_3c_20scalar_2c_20colmajor_2c_20storageindex_20_3e_221',['MappedSparseMatrix< Scalar, ColMajor, StorageIndex >',['https://eigen.tuxfamily.org/dox/classEigen_1_1MappedSparseMatrix.html',1,'']]], - ['mapper_222',['Mapper',['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1reg_1_1Mapper.html',1,'cv::reg']]], - ['mapper_2ehpp_223',['mapper.hpp',['https://docs.opencv.org/4.2.0/df/d13/mapper_8hpp.html',1,'']]], - ['mappergradaffine_224',['MapperGradAffine',['https://docs.opencv.org/4.2.0/d0/d89/classcv_1_1reg_1_1MapperGradAffine.html',1,'cv::reg::MapperGradAffine'],['https://docs.opencv.org/4.2.0/d0/d89/classcv_1_1reg_1_1MapperGradAffine.html#af843e3d2f712f83c2c6562e10e4f44e4',1,'cv::reg::MapperGradAffine::MapperGradAffine()']]], - ['mappergradaffine_2ehpp_225',['mappergradaffine.hpp',['https://docs.opencv.org/4.2.0/d7/d89/mappergradaffine_8hpp.html',1,'']]], - ['mappergradeuclid_226',['MapperGradEuclid',['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1reg_1_1MapperGradEuclid.html',1,'cv::reg::MapperGradEuclid'],['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1reg_1_1MapperGradEuclid.html#aff827d09109e7390de425128afbde638',1,'cv::reg::MapperGradEuclid::MapperGradEuclid()']]], - ['mappergradeuclid_2ehpp_227',['mappergradeuclid.hpp',['https://docs.opencv.org/4.2.0/d3/d4e/mappergradeuclid_8hpp.html',1,'']]], - ['mappergradproj_228',['MapperGradProj',['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1reg_1_1MapperGradProj.html',1,'cv::reg::MapperGradProj'],['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1reg_1_1MapperGradProj.html#adb7d59d8b9e27c063948d160dc378375',1,'cv::reg::MapperGradProj::MapperGradProj()']]], - ['mappergradproj_2ehpp_229',['mappergradproj.hpp',['https://docs.opencv.org/4.2.0/d2/d7f/mappergradproj_8hpp.html',1,'']]], - ['mappergradshift_230',['MapperGradShift',['https://docs.opencv.org/4.2.0/df/d24/classcv_1_1reg_1_1MapperGradShift.html',1,'cv::reg::MapperGradShift'],['https://docs.opencv.org/4.2.0/df/d24/classcv_1_1reg_1_1MapperGradShift.html#a4fcfe0d9e04ea7bcef35e8f73e763cc3',1,'cv::reg::MapperGradShift::MapperGradShift()']]], - ['mappergradshift_2ehpp_231',['mappergradshift.hpp',['https://docs.opencv.org/4.2.0/dc/d62/mappergradshift_8hpp.html',1,'']]], - ['mappergradsimilar_232',['MapperGradSimilar',['https://docs.opencv.org/4.2.0/de/d4c/classcv_1_1reg_1_1MapperGradSimilar.html',1,'cv::reg::MapperGradSimilar'],['https://docs.opencv.org/4.2.0/de/d4c/classcv_1_1reg_1_1MapperGradSimilar.html#a2e5aec1d89aeb13aa7142357002c73a7',1,'cv::reg::MapperGradSimilar::MapperGradSimilar()']]], - ['mappergradsimilar_2ehpp_233',['mappergradsimilar.hpp',['https://docs.opencv.org/4.2.0/d1/d14/mappergradsimilar_8hpp.html',1,'']]], - ['mapperpyramid_234',['MapperPyramid',['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html',1,'cv::reg::MapperPyramid'],['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html#ad248a390a4f7db2430f35803c6493394',1,'cv::reg::MapperPyramid::MapperPyramid()']]], - ['mapperpyramid_2ehpp_235',['mapperpyramid.hpp',['https://docs.opencv.org/4.2.0/de/da9/mapperpyramid_8hpp.html',1,'']]], - ['mapprojec_236',['MapProjec',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html',1,'cv::reg::MapProjec'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#a1a2300e403fb9d92ecbfbfc4437dfe85',1,'cv::reg::MapProjec::MapProjec()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#a89f46cb3a18dd8b293e8d2ed6b64caa3',1,'cv::reg::MapProjec::MapProjec(InputArray projTr)']]], - ['mapprojec_2ehpp_237',['mapprojec.hpp',['https://docs.opencv.org/4.2.0/df/d08/mapprojec_8hpp.html',1,'']]], - ['maps_238',['Unwrap two-dimensional phase maps',['https://docs.opencv.org/4.2.0/d9/dfb/tutorial_unwrap.html',1,'']]], - ['mapshift_239',['MapShift',['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html',1,'cv::reg::MapShift'],['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html#a0b359e0aaaca783ef38058e64c4e9813',1,'cv::reg::MapShift::MapShift()'],['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html#a8821c369932103aeb319edf5dd688bcd',1,'cv::reg::MapShift::MapShift(InputArray shift)']]], - ['mapshift_2ehpp_240',['mapshift.hpp',['https://docs.opencv.org/4.2.0/de/d67/mapshift_8hpp.html',1,'']]], - ['maptypecaster_241',['MapTypeCaster',['https://docs.opencv.org/4.2.0/da/d1b/classcv_1_1reg_1_1MapTypeCaster.html',1,'cv::reg']]], - ['mapx_242',['mapx',['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#ad1b4189a3370713447f3935337f8b0ec',1,'cv::cudev::RemapPtr2']]], - ['mapy_243',['mapy',['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#a12e4cdb3c6de74cbbd59bdb8fd4f4e2a',1,'cv::cudev::RemapPtr2']]], - ['marchcubes_244',['marchCubes',['https://docs.opencv.org/4.2.0/d1/d20/classcv_1_1dynafu_1_1DynaFu.html#addc26a60e4748d1a0fdc3239acd182c1',1,'cv::dynafu::DynaFu']]], - ['marching_20method_245',['Fast Marching Method',['https://docs.opencv.org/4.2.0/db/d18/group__videostab__marching.html',1,'']]], - ['margintype_246',['MarginType',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a9b5c495b5593ffda8a7055da07d0b751',1,'cv::ml::SVMSGD']]], - ['mark_5fcount_247',['mark_count',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a63d9a3b40af6aa139542ab152f18936c',1,'std::basic_regex']]], - ['markasseparated_248',['markAsSeparated',['https://docs.opencv.org/4.2.0/d1/dfd/structcv_1_1optflow_1_1GPCPatchDescriptor.html#a817b5ec10f659b463d084a586c369310',1,'cv::optflow::GPCPatchDescriptor']]], - ['markdevicecopyobsolete_249',['markDeviceCopyObsolete',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#aa7ed39306d6008f2f83654e67856a414',1,'cv::UMatData']]], - ['markdevicememmapped_250',['markDeviceMemMapped',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a2d5b899a98a2ead70375caa03cc37a29',1,'cv::UMatData']]], - ['marker_20detection_251',['ArUco Marker Detection',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html',1,'']]], - ['marker_20detection_20aruco_20module_252',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], - ['marker_5fcross_253',['MARKER_CROSS',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7baf28ad04b7620b2f232ab3c3faef142d5',1,'cv::MARKER_CROSS'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7baf28ad04b7620b2f232ab3c3faef142d5',1,'MARKER_CROSS(Global Namespace)']]], - ['marker_5fdiamond_254',['MARKER_DIAMOND',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba432cfe9d9aa8ff347afd5d11b6580a10',1,'cv::MARKER_DIAMOND'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba432cfe9d9aa8ff347afd5d11b6580a10',1,'MARKER_DIAMOND(Global Namespace)']]], - ['marker_5fsquare_255',['MARKER_SQUARE',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba17aaefd352d309fc4a17d06f64f7f56e',1,'cv::MARKER_SQUARE'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba17aaefd352d309fc4a17d06f64f7f56e',1,'MARKER_SQUARE(Global Namespace)']]], - ['marker_5fstar_256',['MARKER_STAR',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7bad5b611078a497ff7278b27e7a85b059b',1,'cv::MARKER_STAR'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7bad5b611078a497ff7278b27e7a85b059b',1,'MARKER_STAR(Global Namespace)']]], - ['marker_5ftilted_5fcross_257',['MARKER_TILTED_CROSS',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba433d7189d8fe53873c929b917c903752',1,'cv::MARKER_TILTED_CROSS'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba433d7189d8fe53873c929b917c903752',1,'MARKER_TILTED_CROSS(Global Namespace)']]], - ['marker_5ftriangle_5fdown_258',['MARKER_TRIANGLE_DOWN',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba8c45774007ca5883196614763b974577',1,'cv::MARKER_TRIANGLE_DOWN'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba8c45774007ca5883196614763b974577',1,'MARKER_TRIANGLE_DOWN(Global Namespace)']]], - ['marker_5ftriangle_5fup_259',['MARKER_TRIANGLE_UP',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7badc5b55da577d22ace3844809bc9a1049',1,'cv::MARKER_TRIANGLE_UP'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7badc5b55da577d22ace3844809bc9a1049',1,'MARKER_TRIANGLE_UP(Global Namespace)']]], - ['markerborderbits_260',['markerBorderBits',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#ae216e58b9ef6f52cdd72890ddfc060b0',1,'cv::aruco::DetectorParameters']]], - ['markerpattern_261',['MarkerPattern',['../classAR_1_1MarkerPattern.html',1,'AR::MarkerPattern'],['../classAR_1_1MarkerPattern.html#aff809f5b8e8c885380b480df80f7903a',1,'AR::MarkerPattern::MarkerPattern()'],['../classAR_1_1MarkerPattern.html#ab9b392db391fc1ad429105fccf8edf3c',1,'AR::MarkerPattern::MarkerPattern(uint8_t data_region_size, uint8_t border_size, cv::Mat bits, int id)']]], - ['markers_262',['Markers',['https://docs.opencv.org/4.2.0/d5/dae/tutorial_aruco_detection.html',1,'Detection of ArUco Markers'],['https://docs.opencv.org/4.2.0/d5/d07/tutorial_charuco_diamond_detection.html',1,'Detection of Diamond Markers']]], - ['markerset_263',['MarkerSet',['../classAR_1_1MarkerSet.html',1,'AR::MarkerSet'],['../classAR_1_1MarkerSet.html#aa4fde560f82e5b8e822855e6d5934f65',1,'AR::MarkerSet::MarkerSet(uint8_t data_region_size, uint8_t border_size, float physical_size, cv::aruco::Dictionary markerDict)'],['../classAR_1_1MarkerSet.html#a542868baffb1253cb137182d0f389ebe',1,'AR::MarkerSet::MarkerSet(uint8_t data_region_size, uint8_t border_size, float physical_size, cv::Ptr< cv::aruco::Dictionary > markerDictPtr)']]], - ['markersize_264',['markerSize',['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a996eb5d27e061fedf0550092a6149ed7',1,'cv::aruco::Dictionary']]], - ['markerslocation_265',['markersLocation',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#a3ffbabeee2c5ed33fbb2464d842a2cf7',1,'cv::structured_light::SinusoidalPattern::Params']]], - ['markertypes_266',['MarkerTypes',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga0ad87faebef1039ec957737ecc633b7b',1,'cv::MarkerTypes'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga0ad87faebef1039ec957737ecc633b7b',1,'MarkerTypes(Global Namespace)']]], - ['markhostcopyobsolete_267',['markHostCopyObsolete',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a613d3a32b2b6543662d2a9809ce05217',1,'cv::UMatData']]], - ['maroon_268',['maroon',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1b30c08d9f269bfbdb877ce7f582ddd5',1,'cv::viz::Color']]], - ['marr_5fhildreth_5fhash_2ehpp_269',['marr_hildreth_hash.hpp',['https://docs.opencv.org/4.2.0/d3/d20/marr__hildreth__hash_8hpp.html',1,'']]], - ['marrhildrethhash_270',['MarrHildrethHash',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1img__hash_1_1MarrHildrethHash.html',1,'cv::img_hash::MarrHildrethHash'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1img__hash_1_1MarrHildrethHash.html#aec90e4ce0b3b2c2045f8eae8e4cc65f8',1,'cv::img_hash::MarrHildrethHash::MarrHildrethHash()']]], - ['marrhildrethhash_271',['marrHildrethHash',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gaf849522d808a8ef9ae2ed9422cf236b7',1,'cv::img_hash::marrHildrethHash()'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gaf849522d808a8ef9ae2ed9422cf236b7',1,'marrHildrethHash()(Global Namespace)']]], - ['mask_272',['mask',['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#a98eb6356c2c4c84a1dd8ab751aef206a',1,'cv::rgbd::RgbdFrame::mask'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#affc58592272d7281fa4e868c7d7831c4',1,'cv::cudev::SingleMaskChannels::mask'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaba076d51941328cb7ca9348b7b535220',1,'cv::gapi::mask()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaba076d51941328cb7ca9348b7b535220',1,'mask(const GMat &src, const GMat &mask)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145af2ce11ebf110993621bedd8e747d7b1b',1,'mask(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145af2ce11ebf110993621bedd8e747d7b1b',1,'mask(Global Namespace)']]], - ['mask_20operations_20on_20matrices_273',['Mask operations on matrices',['https://docs.opencv.org/4.2.0/d7/d37/tutorial_mat_mask_operations.html',1,'']]], - ['mask_2ehpp_274',['mask.hpp',['https://docs.opencv.org/4.2.0/d3/dbb/mask_8hpp.html',1,'']]], - ['mask1_275',['mask1',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a17dea5e87ecb4cd70334382de54ebc01',1,'cv::cuda::SURF_CUDA']]], - ['mask_5farray_276',['mask_array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04659.html',1,'std::mask_array< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga63910750064214d819524e634cdaebfa',1,'std::mask_array::mask_array()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga63910750064214d819524e634cdaebfa',1,'mask_array(const mask_array &)(Global Namespace)']]], - ['mask_5farray_2eh_277',['mask_array.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00419.html',1,'']]], - ['mask_5fbased_5frange_5fhashing_278',['mask_based_range_hashing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11735.html',1,'__gnu_pbds::detail']]], - ['mask_5fbased_5frange_5fhashing_2ehpp_279',['mask_based_range_hashing.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01319.html',1,'']]], - ['maskframesource_280',['MaskFrameSource',['https://docs.opencv.org/4.2.0/da/d26/classcv_1_1videostab_1_1MaskFrameSource.html',1,'cv::videostab::MaskFrameSource'],['https://docs.opencv.org/4.2.0/da/d26/classcv_1_1videostab_1_1MaskFrameSource.html#a8b94dbd043a3bc436839c15ba0c8e943',1,'cv::videostab::MaskFrameSource::MaskFrameSource()']]], - ['maskgenerator_281',['MaskGenerator',['https://docs.opencv.org/4.2.0/d6/dfb/classcv_1_1BaseCascadeClassifier_1_1MaskGenerator.html',1,'cv::BaseCascadeClassifier']]], - ['maskistiled_282',['MaskIsTiled',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa9a2b6e0d80053fdd4909ef6cf80326d8',1,'cv::Error']]], - ['masks_5f_283',['masks_',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a3db4bcfb73c963e7eeb92ecffdda5db6',1,'cv::detail::PairwiseSeamFinder']]], - ['masksource_284',['maskSource',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#af1488f09ab147bd9d06b775189d255b7',1,'cv::videostab::StabilizerBase']]], - ['masksource_5f_285',['maskSource_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a7d8e382c7286c16bc44ed07160ecf6c0',1,'cv::videostab::StabilizerBase']]], - ['masksum_286',['maskSum',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a45223b25f9b1dbf54b2afb84db4970e1',1,'cv::cuda::SURF_CUDA']]], - ['master_20installation_20by_20using_20git_20bash_20version_202_2014_201_20and_20cmake_20version_203_209_201_287',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], - ['mat_288',['Mat',['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html',1,'cv::gapi::own::Mat'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html',1,'cv::Mat'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af1d014cecd1510cdf580bf2ed7e5aafc',1,'cv::Mat::Mat()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a2ec3402f7d165ca34c7fd6e8498a62ca',1,'cv::Mat::Mat(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a75a97b1e4e55f380c172af58048a7cde',1,'cv::Mat::Mat(Size size, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a3620c370690b5ca4d40c767be6fb4ceb',1,'cv::Mat::Mat(int rows, int cols, int type, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a286371a6196eaaaf0b86e158590460b7',1,'cv::Mat::Mat(Size size, int type, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a156df5a1326dd5c30b187b0e721a5f57',1,'cv::Mat::Mat(int ndims, const int *sizes, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a6adc4d64db5379bcbb713e71c9292f6e',1,'cv::Mat::Mat(const std::vector< int > &sizes, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#afbf34be80b7443123b2a032a67c3c4e3',1,'cv::Mat::Mat(int ndims, const int *sizes, int type, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ad20a78b5501fc39543a240142a40e234',1,'cv::Mat::Mat(const std::vector< int > &sizes, int type, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a294eaf8a95d2f9c7be19ff594d06278e',1,'cv::Mat::Mat(const Mat &m)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a51615ebf17a64c968df0bf49b4de6a3a',1,'cv::Mat::Mat(int rows, int cols, int type, void *data, size_t step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a9fa74fb14362d87cb183453d2441948f',1,'cv::Mat::Mat(Size size, int type, void *data, size_t step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a5fafc033e089143062fd31015b5d0f40',1,'cv::Mat::Mat(int ndims, const int *sizes, int type, void *data, const size_t *steps=0)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a922de793eabcec705b3579c5f95a643e',1,'cv::Mat::Mat(const std::vector< int > &sizes, int type, void *data, const size_t *steps=0)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a92a3e9e5911a2eb0cf0950a0a9670c76',1,'cv::Mat::Mat(const Mat &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa7ec97373406215f2d4bc72cc1d27036',1,'cv::Mat::Mat(const Mat &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#afde22a742fc73c0a150a9002310ac2eb',1,'cv::Mat::Mat(const Mat &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa6e903a6c762478692791a33d233019b',1,'cv::Mat::Mat(const Mat &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a23b182c4ffd46abe38f460c1480ae887',1,'cv::Mat::Mat(const std::vector< _Tp > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#afccd5d581d7dc205925debf83ea4c7be',1,'cv::Mat::Mat(const std::initializer_list< _Tp > list)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a174d591e68a4876f7164aefb1f3551d5',1,'cv::Mat::Mat(const std::initializer_list< int > sizes, const std::initializer_list< _Tp > list)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af831f6ce5e9ff546682e8155b5c835b1',1,'cv::Mat::Mat(const std::array< _Tp, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a507e01fb48b34a3e5c45f9f5b00725e8',1,'cv::Mat::Mat(const Vec< _Tp, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a37068a8d9acc7cc5af817eb82b2aa83b',1,'cv::Mat::Mat(const Matx< _Tp, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a224477889ddc7424aaab1b76e7682ea2',1,'cv::Mat::Mat(const Point_< _Tp > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a7d72610ed5aed9117eb7933a97670309',1,'cv::Mat::Mat(const Point3_< _Tp > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a23957ae2fed348c67952c0d69c873972',1,'cv::Mat::Mat(const MatCommaInitializer_< _Tp > &commaInitializer)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa82eca82664985c81c7912b04549370d',1,'cv::Mat::Mat(const cuda::GpuMat &m)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#adcaeb226bafeff8a1b262f57f6ffbcc4',1,'cv::Mat::Mat(Mat &&m)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a16a2cd2d814cbd55c45a48c7a0baf1c0',1,'cv::gapi::own::Mat::Mat()=default'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#ae1d3f6c4e8f742d83a2db8a399d39f1c',1,'cv::gapi::own::Mat::Mat(int _rows, int _cols, int _type, void *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#aa6165a0c8d914383bca8d9cc514d817c',1,'cv::gapi::own::Mat::Mat(const std::vector< int > &_dims, int _type, void *_data)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a70c8088d155be7349395707b82af3201',1,'cv::gapi::own::Mat::Mat(std::vector< int > &&_dims, int _type, void *_data)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#ac23d30e1c30faab9b75ed2017bfc6a78',1,'cv::gapi::own::Mat::Mat(Mat const &src, const Rect &roi)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a1a1fc825c35cd15ab6ed58577b656611',1,'cv::gapi::own::Mat::Mat(Mat const &src)=default'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a5dcf42d437b66adb458a0d7bccff564a',1,'cv::gapi::own::Mat::Mat(Mat &&src)=default']]], - ['mat_289',['MAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba78b5339efc1a4718ab6a1b688ccffc1c',1,'cv::_InputArray']]], - ['mat_290',['mat',['https://docs.opencv.org/4.2.0/d9/dff/structcv_1_1datasets_1_1IR__affineObj.html#a64e3005ee9661a9a8b67bc8a35afc902',1,'cv::datasets::IR_affineObj::mat'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a42a7627680e1866327c479e0e38cc889',1,'cv::FileNode::mat()']]], - ['mat_291',['MAT',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aaf0c2c0ca864067cc6e21a7ea2c1b1fdd',1,'MAT(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aaf0c2c0ca864067cc6e21a7ea2c1b1fdd',1,'MAT(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aaf0c2c0ca864067cc6e21a7ea2c1b1fdd',1,'MAT(Global Namespace)']]], - ['mat_20data_292',['Plot function for Mat data',['https://docs.opencv.org/4.2.0/db/dfe/group__plot.html',1,'']]], - ['mat_20the_20basic_20image_20container_293',['Mat - The Basic Image Container',['https://docs.opencv.org/4.2.0/d6/d6d/tutorial_mat_the_basic_image_container.html',1,'']]], - ['mat_2ehpp_294',['mat.hpp',['https://docs.opencv.org/4.2.0/d3/d82/core_2include_2opencv2_2core_2mat_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d69/gapi_2include_2opencv2_2gapi_2own_2mat_8hpp.html',1,'(Global Namespace)']]], - ['mat1_295',['mat1',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html#ae5c8c96e9d4f371b590ea554d96405d1',1,'cv::datasets::cameraParam']]], - ['mat1b_296',['Mat1b',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1d355af1bc5c7241588bdb3600951515',1,'cv::Mat1b'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1d355af1bc5c7241588bdb3600951515',1,'Mat1b(Global Namespace)']]], - ['mat1d_297',['Mat1d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8dc8a9e248a8885bb3c61d35f07b61ed',1,'cv::Mat1d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8dc8a9e248a8885bb3c61d35f07b61ed',1,'Mat1d(Global Namespace)']]], - ['mat1f_298',['Mat1f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga9747ac59f97cbb93ddd719c4fb3e2d5d',1,'cv::Mat1f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga9747ac59f97cbb93ddd719c4fb3e2d5d',1,'Mat1f(Global Namespace)']]], - ['mat1i_299',['Mat1i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga87332e283de569e7bb029d4f4b401dcc',1,'cv::Mat1i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga87332e283de569e7bb029d4f4b401dcc',1,'Mat1i(Global Namespace)']]], - ['mat1s_300',['Mat1s',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0c456856506ff905ce035acec092ef9f',1,'cv::Mat1s'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0c456856506ff905ce035acec092ef9f',1,'Mat1s(Global Namespace)']]], - ['mat1w_301',['Mat1w',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga4895c2ba170884f13b4a1b1c80fea8ff',1,'cv::Mat1w'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga4895c2ba170884f13b4a1b1c80fea8ff',1,'Mat1w(Global Namespace)']]], - ['mat2_302',['mat2',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html#a79533c441eb4c06bff212f8652f1f5a7',1,'cv::datasets::cameraParam']]], - ['mat2b_303',['Mat2b',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf7e98a9c920ba16ba08b99bb53c52224',1,'cv::Mat2b'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf7e98a9c920ba16ba08b99bb53c52224',1,'Mat2b(Global Namespace)']]], - ['mat2d_304',['Mat2d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga04278ad1d5a287e15c07239d6119fe0a',1,'cv::Mat2d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga04278ad1d5a287e15c07239d6119fe0a',1,'Mat2d(Global Namespace)']]], - ['mat2f_305',['Mat2f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5d6e8769d5f6a8b21eb59137e643f095',1,'cv::Mat2f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5d6e8769d5f6a8b21eb59137e643f095',1,'Mat2f(Global Namespace)']]], - ['mat2i_306',['Mat2i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1ee6db17208ebd8bef5749d81267bf17',1,'cv::Mat2i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1ee6db17208ebd8bef5749d81267bf17',1,'Mat2i(Global Namespace)']]], - ['mat2s_307',['Mat2s',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf945be4c317df201188e50e578e1fa75',1,'cv::Mat2s'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf945be4c317df201188e50e578e1fa75',1,'Mat2s(Global Namespace)']]], - ['mat2w_308',['Mat2w',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaeb96ec2e3fd29bc27da746681e692b60',1,'cv::Mat2w'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaeb96ec2e3fd29bc27da746681e692b60',1,'Mat2w(Global Namespace)']]], - ['mat3_309',['mat3',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html#a806a1c2e37b570d2212307a16be4e2cf',1,'cv::datasets::cameraParam']]], - ['mat3_310',['Mat3',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a37ca518be694a545a9572a3e5546e9e8',1,'cv::Affine3::Mat3'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a37ca518be694a545a9572a3e5546e9e8',1,'Affine3< float >::Mat3']]], - ['mat3b_311',['Mat3b',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7198dbdcacbcde70f7c7d1209d57146a',1,'cv::Mat3b'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7198dbdcacbcde70f7c7d1209d57146a',1,'Mat3b(Global Namespace)']]], - ['mat3d_312',['Mat3d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf14b1aa52fc952072c0b653f916ffac8',1,'cv::Mat3d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf14b1aa52fc952072c0b653f916ffac8',1,'Mat3d(Global Namespace)']]], - ['mat3f_313',['Mat3f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8ee031423ba0ecb65fef2bc40abd970e',1,'cv::Mat3f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8ee031423ba0ecb65fef2bc40abd970e',1,'Mat3f(Global Namespace)']]], - ['mat3i_314',['Mat3i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga89d566f26821c717c666d31bcfc6bf35',1,'cv::Mat3i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga89d566f26821c717c666d31bcfc6bf35',1,'Mat3i(Global Namespace)']]], - ['mat3s_315',['Mat3s',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga4c3cec2bb940613dec561e59b0948801',1,'cv::Mat3s'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga4c3cec2bb940613dec561e59b0948801',1,'Mat3s(Global Namespace)']]], - ['mat3w_316',['Mat3w',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5574e954e5acfdb4e1e03e1dbd8bab6a',1,'cv::Mat3w'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5574e954e5acfdb4e1e03e1dbd8bab6a',1,'Mat3w(Global Namespace)']]], - ['mat4_317',['mat4',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html#a8cffc15426d4fa26e2e944e0a4a27e98',1,'cv::datasets::cameraParam']]], - ['mat4_318',['Mat4',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a9466d60cebb8d94b8bf23e52aa89b95b',1,'cv::Affine3::Mat4'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a9466d60cebb8d94b8bf23e52aa89b95b',1,'Affine3< float >::Mat4']]], - ['mat4b_319',['Mat4b',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga38bd307d9a0cac4c335e648ef8b63a3e',1,'cv::Mat4b'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga38bd307d9a0cac4c335e648ef8b63a3e',1,'Mat4b(Global Namespace)']]], - ['mat4d_320',['Mat4d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gab7781ee46e4a6148e037be23217201dc',1,'cv::Mat4d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gab7781ee46e4a6148e037be23217201dc',1,'Mat4d(Global Namespace)']]], - ['mat4f_321',['Mat4f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga781cc98063ecb8e02e3576140714842f',1,'cv::Mat4f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga781cc98063ecb8e02e3576140714842f',1,'Mat4f(Global Namespace)']]], - ['mat4i_322',['Mat4i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8895fd82b424209f63bf9713fd5259a2',1,'cv::Mat4i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8895fd82b424209f63bf9713fd5259a2',1,'Mat4i(Global Namespace)']]], - ['mat4s_323',['Mat4s',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7de7f3b26b41d7326e85ab2e5d9eb1c4',1,'cv::Mat4s'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7de7f3b26b41d7326e85ab2e5d9eb1c4',1,'Mat4s(Global Namespace)']]], - ['mat4w_324',['Mat4w',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga66c490bf66285c5cb0b5a21696d0cd03',1,'cv::Mat4w'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga66c490bf66285c5cb0b5a21696d0cd03',1,'Mat4w(Global Namespace)']]], - ['mat_5f_325',['Mat_',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'cv::Mat_< _Tp >'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'cv::Mat_::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'cv::Mat_::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'cv::Mat_::Mat_(int _rows, int _cols, const _Tp &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'cv::Mat_::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'cv::Mat_::Mat_(Size _size, const _Tp &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'cv::Mat_::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'cv::Mat_::Mat_(int _ndims, const int *_sizes, const _Tp &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'cv::Mat_::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'cv::Mat_::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'cv::Mat_::Mat_(int _rows, int _cols, _Tp *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'cv::Mat_::Mat_(int _ndims, const int *_sizes, _Tp *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'cv::Mat_::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'cv::Mat_::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'cv::Mat_::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'cv::Mat_::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'cv::Mat_::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'cv::Mat_::Mat_(const std::vector< _Tp > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'cv::Mat_::Mat_(const Vec< typename DataType< _Tp >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'cv::Mat_::Mat_(const Matx< typename DataType< _Tp >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'cv::Mat_::Mat_(const Point_< typename DataType< _Tp >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'cv::Mat_::Mat_(const Point3_< typename DataType< _Tp >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'cv::Mat_::Mat_(const MatCommaInitializer_< _Tp > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'cv::Mat_::Mat_(std::initializer_list< _Tp > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'cv::Mat_::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< _Tp > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'cv::Mat_::Mat_(const std::array< _Tp, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'cv::Mat_::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'cv::Mat_::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'cv::Mat_::Mat_(MatExpr &&e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'Mat_< double >::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'Mat_< double >::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'Mat_< double >::Mat_(int _rows, int _cols, const double &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'Mat_< double >::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'Mat_< double >::Mat_(Size _size, const double &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'Mat_< double >::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'Mat_< double >::Mat_(int _ndims, const int *_sizes, const double &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'Mat_< double >::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'Mat_< double >::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'Mat_< double >::Mat_(int _rows, int _cols, double *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'Mat_< double >::Mat_(int _ndims, const int *_sizes, double *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'Mat_< double >::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'Mat_< double >::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'Mat_< double >::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'Mat_< double >::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'Mat_< double >::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'Mat_< double >::Mat_(const std::vector< double > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'Mat_< double >::Mat_(const Vec< typename DataType< double >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'Mat_< double >::Mat_(const Matx< typename DataType< double >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'Mat_< double >::Mat_(const Point_< typename DataType< double >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'Mat_< double >::Mat_(const Point3_< typename DataType< double >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'Mat_< double >::Mat_(const MatCommaInitializer_< double > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'Mat_< double >::Mat_(std::initializer_list< double > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'Mat_< double >::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< double > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'Mat_< double >::Mat_(const std::array< double, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'Mat_< double >::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'Mat_< double >::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'Mat_< double >::Mat_(MatExpr &&e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'Mat_< float >::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'Mat_< float >::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'Mat_< float >::Mat_(int _rows, int _cols, const float &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'Mat_< float >::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'Mat_< float >::Mat_(Size _size, const float &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'Mat_< float >::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'Mat_< float >::Mat_(int _ndims, const int *_sizes, const float &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'Mat_< float >::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'Mat_< float >::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'Mat_< float >::Mat_(int _rows, int _cols, float *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'Mat_< float >::Mat_(int _ndims, const int *_sizes, float *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'Mat_< float >::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'Mat_< float >::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'Mat_< float >::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'Mat_< float >::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'Mat_< float >::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'Mat_< float >::Mat_(const std::vector< float > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'Mat_< float >::Mat_(const Vec< typename DataType< float >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'Mat_< float >::Mat_(const Matx< typename DataType< float >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'Mat_< float >::Mat_(const Point_< typename DataType< float >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'Mat_< float >::Mat_(const Point3_< typename DataType< float >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'Mat_< float >::Mat_(const MatCommaInitializer_< float > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'Mat_< float >::Mat_(std::initializer_list< float > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'Mat_< float >::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< float > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'Mat_< float >::Mat_(const std::array< float, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'Mat_< float >::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'Mat_< float >::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'Mat_< float >::Mat_(MatExpr &&e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'Mat_< uchar >::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'Mat_< uchar >::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'Mat_< uchar >::Mat_(int _rows, int _cols, const uchar &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'Mat_< uchar >::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'Mat_< uchar >::Mat_(Size _size, const uchar &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'Mat_< uchar >::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'Mat_< uchar >::Mat_(int _ndims, const int *_sizes, const uchar &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'Mat_< uchar >::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'Mat_< uchar >::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'Mat_< uchar >::Mat_(int _rows, int _cols, uchar *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'Mat_< uchar >::Mat_(int _ndims, const int *_sizes, uchar *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'Mat_< uchar >::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'Mat_< uchar >::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'Mat_< uchar >::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'Mat_< uchar >::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'Mat_< uchar >::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'Mat_< uchar >::Mat_(const std::vector< uchar > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'Mat_< uchar >::Mat_(const Vec< typename DataType< uchar >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'Mat_< uchar >::Mat_(const Matx< typename DataType< uchar >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'Mat_< uchar >::Mat_(const Point_< typename DataType< uchar >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'Mat_< uchar >::Mat_(const Point3_< typename DataType< uchar >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'Mat_< uchar >::Mat_(const MatCommaInitializer_< uchar > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'Mat_< uchar >::Mat_(std::initializer_list< uchar > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'Mat_< uchar >::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< uchar > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'Mat_< uchar >::Mat_(const std::array< uchar, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'Mat_< uchar >::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'Mat_< uchar >::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'Mat_< uchar >::Mat_(MatExpr &&e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'Mat_< unsigned char >::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'Mat_< unsigned char >::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'Mat_< unsigned char >::Mat_(int _rows, int _cols, const unsigned char &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'Mat_< unsigned char >::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'Mat_< unsigned char >::Mat_(Size _size, const unsigned char &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'Mat_< unsigned char >::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'Mat_< unsigned char >::Mat_(int _ndims, const int *_sizes, const unsigned char &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'Mat_< unsigned char >::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'Mat_< unsigned char >::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'Mat_< unsigned char >::Mat_(int _rows, int _cols, unsigned char *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'Mat_< unsigned char >::Mat_(int _ndims, const int *_sizes, unsigned char *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'Mat_< unsigned char >::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'Mat_< unsigned char >::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'Mat_< unsigned char >::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'Mat_< unsigned char >::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'Mat_< unsigned char >::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'Mat_< unsigned char >::Mat_(const std::vector< unsigned char > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'Mat_< unsigned char >::Mat_(const Vec< typename DataType< unsigned char >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'Mat_< unsigned char >::Mat_(const Matx< typename DataType< unsigned char >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'Mat_< unsigned char >::Mat_(const Point_< typename DataType< unsigned char >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'Mat_< unsigned char >::Mat_(const Point3_< typename DataType< unsigned char >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'Mat_< unsigned char >::Mat_(const MatCommaInitializer_< unsigned char > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'Mat_< unsigned char >::Mat_(std::initializer_list< unsigned char > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'Mat_< unsigned char >::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< unsigned char > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'Mat_< unsigned char >::Mat_(const std::array< unsigned char, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'Mat_< unsigned char >::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'Mat_< unsigned char >::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'Mat_< unsigned char >::Mat_(MatExpr &&e)']]], - ['mat_5f_3c_20double_20_3e_326',['Mat_< double >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], - ['mat_5f_3c_20float_20_3e_327',['Mat_< float >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], - ['mat_5f_3c_20int_20_3e_328',['Mat_< int >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], - ['mat_5f_3c_20uchar_20_3e_329',['Mat_< uchar >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], - ['mat_5f_3c_20unsigned_20char_20_3e_330',['Mat_< unsigned char >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], - ['mat_5fmask_5foperations_2emarkdown_331',['mat_mask_operations.markdown',['https://docs.opencv.org/4.2.0/d6/d41/mat__mask__operations_8markdown.html',1,'']]], - ['mat_5foperations_2emarkdown_332',['mat_operations.markdown',['https://docs.opencv.org/4.2.0/d8/d36/mat__operations_8markdown.html',1,'']]], - ['mat_5fthe_5fbasic_5fimage_5fcontainer_2emarkdown_333',['mat_the_basic_image_container.markdown',['https://docs.opencv.org/4.2.0/dc/d90/mat__the__basic__image__container_8markdown.html',1,'']]], - ['mat_5ftype_334',['mat_type',['https://docs.opencv.org/4.2.0/d2/d60/structcv_1_1quality_1_1QualityGMSD_1_1__mat__data.html#adfba652a0b78ac3362f46a87ed34a987',1,'cv::quality::QualityGMSD::_mat_data::mat_type'],['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#af77780870032e20cfdc3909bd8a3a96d',1,'cv::quality::QualitySSIM::_mat_data::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'cv::Matx::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< _Tp, cn, 1 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, 1, 3 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, 2, 2 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, 2, 3 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, 3, 3 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, 3, 4 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, 4, 4 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, cn, 1 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< float, 2, 3 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< float, 3, 3 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< float, cn, 1 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< float_type, 4, 4 >::mat_type']]], - ['mat_5fvector_335',['MAT_VECTOR',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aac4f6db46662589f21d34d4abafdf8fb7',1,'MAT_VECTOR(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aac4f6db46662589f21d34d4abafdf8fb7',1,'MAT_VECTOR(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aac4f6db46662589f21d34d4abafdf8fb7',1,'MAT_VECTOR(Global Namespace)']]], - ['matallocator_336',['MatAllocator',['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html',1,'cv::MatAllocator'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#a279cc239b836c7f06e60de9d00f8f73f',1,'cv::MatAllocator::MatAllocator()']]], - ['match_337',['Match',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html',1,'cv::linemod::Match'],['https://docs.opencv.org/4.2.0/df/dee/structcv_1_1stereo_1_1Match.html',1,'cv::stereo::Match'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#aa8283f8751fb7887d18eb024ef200adb',1,'cv::linemod::Match::Match()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0ee629062c3c2745dba41a3e3605ff49',1,'cv::linemod::Match::Match(int x, int y, float similarity, const String &class_id, int template_id)']]], - ['match_338',['match',['https://docs.opencv.org/4.2.0/d3/dda/classcv_1_1detail_1_1AffineBestOf2NearestMatcher.html#a565d4c8159841f78b6a27e479c45f2f9',1,'cv::detail::AffineBestOf2NearestMatcher::match()'],['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#ad50ac0d2cbc1d4ee3c52ec7a81d63408',1,'cv::detail::BestOf2NearestMatcher::match()'],['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html#a72ab280d507ccb95240300ecd0b00fc0',1,'cv::line_descriptor::BinaryDescriptorMatcher::match(const Mat &queryDescriptors, const Mat &trainDescriptors, std::vector< DMatch > &matches, const Mat &mask=Mat()) const'],['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html#a0f353796fee66fe7e2692a5cce29861d',1,'cv::line_descriptor::BinaryDescriptorMatcher::match(const Mat &queryDescriptors, std::vector< DMatch > &matches, const std::vector< Mat > &masks=std::vector< Mat >())'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a0f046f47b68ec7074391e1e85c750cba',1,'cv::DescriptorMatcher::match(InputArray queryDescriptors, InputArray trainDescriptors, std::vector< DMatch > &matches, InputArray mask=noArray()) const'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a695c0aceafc907c024c24a0b5cdff758',1,'cv::DescriptorMatcher::match(InputArray queryDescriptors, std::vector< DMatch > &matches, InputArrayOfArrays masks=noArray())'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a062cb997b9031a7acbe77f4f60682304',1,'cv::cuda::DescriptorMatcher::match(InputArray queryDescriptors, InputArray trainDescriptors, std::vector< DMatch > &matches, InputArray mask=noArray())=0'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a71f79d53a5d321077b43bf25603a306e',1,'cv::cuda::DescriptorMatcher::match(InputArray queryDescriptors, std::vector< DMatch > &matches, const std::vector< GpuMat > &masks=std::vector< GpuMat >())=0'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a57ec7d6920aa3d31f91ac6972cb12ee5',1,'cv::linemod::Detector::match()'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a22005bcc8bf637398b2a325121b44bb1',1,'cv::detail::FeaturesMatcher::match()'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a13757c035f9c95841f7f14f6170c8ffc',1,'cv::ppf_match_3d::PPF3DDetector::match()'],['https://docs.opencv.org/4.2.0/d2/d58/classcv_1_1cuda_1_1TemplateMatching.html#a05a565a53461c916b3b10737cbe43a01',1,'cv::cuda::TemplateMatching::match()']]], - ['match_339',['Match',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0ee629062c3c2745dba41a3e3605ff49',1,]]], - ['match_5fany_340',['match_any',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#af78cac45372ace2e9fdd8bcf7eb27399',1,'std::regex_constants']]], - ['match_5fcontinuous_341',['match_continuous',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a372e043458fd815d130056e1225a00a5',1,'std::regex_constants']]], - ['match_5fdefault_342',['match_default',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ac070d8adb9f48dcfad7f69f4f2373708',1,'std::regex_constants']]], - ['match_5fflag_5ftype_343',['match_flag_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#aaa717c7c94d1075dfb06f79feb4ca11c',1,'std::regex_constants']]], - ['match_5fnot_5fbol_344',['match_not_bol',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#af0a051640e6d5b7be783ecef1bd6057c',1,'std::regex_constants']]], - ['match_5fnot_5fbow_345',['match_not_bow',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ae61a11ae1d6998a161bdbb50c63dd0e2',1,'std::regex_constants']]], - ['match_5fnot_5feol_346',['match_not_eol',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a2fa4bcec54ff420f477a7bbfe6f9925b',1,'std::regex_constants']]], - ['match_5fnot_5feow_347',['match_not_eow',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a7e422c4098322e3bf17eafd35fc16c7e',1,'std::regex_constants']]], - ['match_5fnot_5fnull_348',['match_not_null',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#aa135ecb11f0299ff447a7133a91d73e3',1,'std::regex_constants']]], - ['match_5fprev_5favail_349',['match_prev_avail',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ad48b9cdb07f0c311ec5ffeb093c209d5',1,'std::regex_constants']]], - ['match_5fresults_350',['match_results',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html',1,'std::match_results< _Bi_iter, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a71da2bf97751acc14fe35dd77013485c',1,'match_results< _Bi_iter >::match_results(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a65c2c5b7bac305ad0c09cc96b3f39d71',1,'match_results< _Bi_iter >::match_results(match_results &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ad83ac42bb1d27df742e20884719b7359',1,'match_results< _Bi_iter >::match_results()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6eae2dd42c7d50268871d04fb640759d',1,'match_results< _Bi_iter >::match_results(const allocator< sub_match< _Bi_iter > > &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ad83ac42bb1d27df742e20884719b7359',1,'match_results< _Bi_iter >::match_results()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6eae2dd42c7d50268871d04fb640759d',1,'match_results< _Bi_iter >::match_results(const allocator< sub_match< _Bi_iter > > &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a71da2bf97751acc14fe35dd77013485c',1,'std::match_results::match_results(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a65c2c5b7bac305ad0c09cc96b3f39d71',1,'std::match_results::match_results(match_results &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ad83ac42bb1d27df742e20884719b7359',1,'std::match_results::match_results()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6eae2dd42c7d50268871d04fb640759d',1,'std::match_results::match_results(const _Alloc &__a) noexcept']]], - ['match_5fresults_3c_20_5fbi_5fiter_20_3e_351',['match_results< _Bi_iter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html',1,'']]], - ['matchasync_352',['matchAsync',['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#aad20d402f63e8d01cbf881476ea1a798',1,'cv::cuda::DescriptorMatcher::matchAsync(InputArray queryDescriptors, InputArray trainDescriptors, OutputArray matches, InputArray mask=noArray(), Stream &stream=Stream::Null())=0'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a4d255fb28411740971a763747109d4e3',1,'cv::cuda::DescriptorMatcher::matchAsync(InputArray queryDescriptors, OutputArray matches, const std::vector< GpuMat > &masks=std::vector< GpuMat >(), Stream &stream=Stream::Null())=0']]], - ['matchclass_353',['matchClass',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a189b904ea0b9e500c5c64a52da9ec73c',1,'cv::linemod::Detector']]], - ['matchconvert_354',['matchConvert',['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a567592e9866ee163c353acc39850a7fb',1,'cv::cuda::DescriptorMatcher']]], - ['matchers_355',['Descriptor Matchers',['https://docs.opencv.org/4.2.0/d8/d9b/group__features2d__match.html',1,'']]], - ['matchers_2ehpp_356',['matchers.hpp',['https://docs.opencv.org/4.2.0/d3/dc9/matchers_8hpp.html',1,'']]], - ['matchertype_357',['MatcherType',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3b',1,'cv::DescriptorMatcher']]], - ['matches_358',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], - ['matches_359',['matches',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#a36e0824c319b6a9d7ea3eab66e27b6d0',1,'cv::detail::MatchesInfo']]], - ['matchesgraphasstring_360',['matchesGraphAsString',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gabaeb9dab170ea8066ae2583bf3a669e9',1,'cv::detail::matchesGraphAsString()'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gabaeb9dab170ea8066ae2583bf3a669e9',1,'matchesGraphAsString()(Global Namespace)']]], - ['matchesinfo_361',['MatchesInfo',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html',1,'cv::detail::MatchesInfo'],['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#aeafb1a764b2fe15f8c5c0fcd790f5d2a',1,'cv::detail::MatchesInfo::MatchesInfo()'],['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#aa99a3ff020a99c03c4016deadbf28d42',1,'cv::detail::MatchesInfo::MatchesInfo(const MatchesInfo &other)']]], - ['matchgms_362',['matchGMS',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#gaaf19e0024c555f8d8982396376150288',1,'cv::xfeatures2d::matchGMS()'],['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#gaaf19e0024c555f8d8982396376150288',1,'matchGMS(const Size &size1, const Size &size2, const std::vector< KeyPoint > &keypoints1, const std::vector< KeyPoint > &keypoints2, const std::vector< DMatch > &matches1to2, std::vector< DMatch > &matchesGMS, const bool withRotation=false, const bool withScale=false, const double thresholdFactor=6.0)(Global Namespace)']]], - ['matching_363',['AKAZE local features matching',['https://docs.opencv.org/4.2.0/db/d70/tutorial_akaze_matching.html',1,'']]], - ['matching_364',['Matching',['https://docs.opencv.org/4.2.0/dc/dc3/tutorial_py_matcher.html',1,'Feature Matching'],['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'Features Finding and Images Matching'],['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html',1,'cv::stereo::Matching'],['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a6fdc5a79dd5408b8d865a594f56dae2b',1,'cv::stereo::Matching::Matching(void)'],['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a07f5f3e41212ea87c0314a264ee8865b',1,'cv::stereo::Matching::Matching(int maxDisp, int scalling=4, int confidence=6)'],['https://docs.opencv.org/4.2.0/d7/dd5/group__datasets__msm.html',1,'Multiview Stereo Matching'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html',1,'Shape Distance and Matching'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html',1,'Surface Matching'],['https://docs.opencv.org/4.2.0/de/da9/tutorial_template_matching.html',1,'Template Matching'],['https://docs.opencv.org/4.2.0/d4/dc6/tutorial_py_template_matching.html',1,'Template Matching'],['https://docs.opencv.org/4.2.0/d8/dd1/tutorial_js_template_matching.html',1,'Template Matching']]], - ['matching_20algorithm_365',['Experimental 2D Features Matching Algorithm',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html',1,'']]], - ['matching_20homography_20to_20find_20objects_366',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], - ['matching_20with_20flann_367',['Feature Matching with FLANN',['https://docs.opencv.org/4.2.0/d5/d6f/tutorial_feature_flann_matcher.html',1,'']]], - ['matching_2ehpp_368',['matching.hpp',['https://docs.opencv.org/4.2.0/dd/ddf/matching_8hpp.html',1,'']]], - ['matchingmask_369',['matchingMask',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a4b2624192c5854601f4baebeee321c81',1,'cv::Stitcher']]], - ['matchlogos_370',['matchLOGOS',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#ga55b555fffec434bf0cdf99b454056f7b',1,'cv::xfeatures2d::matchLOGOS()'],['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#ga55b555fffec434bf0cdf99b454056f7b',1,'matchLOGOS()(Global Namespace)']]], - ['matchshapes_371',['matchShapes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaadc90cb16e2362c9bd6e7363e6e4c317',1,'cv::matchShapes()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaadc90cb16e2362c9bd6e7363e6e4c317',1,'matchShapes()(Global Namespace)']]], - ['matchtemplate_372',['matchTemplate',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#ga586ebfb0a7fb604b35a23d85391329be',1,'cv::matchTemplate()'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#ga586ebfb0a7fb604b35a23d85391329be',1,'matchTemplate()(Global Namespace)']]], - ['matchtemplatedistance_373',['MatchTemplateDistance',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1tbm_1_1MatchTemplateDistance.html',1,'cv::tbm::MatchTemplateDistance'],['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1tbm_1_1MatchTemplateDistance.html#a585d8ca37c334ef9d29c93a09f0c94cd',1,'cv::tbm::MatchTemplateDistance::MatchTemplateDistance()']]], - ['matcommainitializer_5f_374',['MatCommaInitializer_',['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html',1,'cv::MatCommaInitializer_< _Tp >'],['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html#a4feb484303b5f8d2a6198caed71d8841',1,'cv::MatCommaInitializer_::MatCommaInitializer_()']]], - ['matconstiterator_375',['MatConstIterator',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html',1,'cv::MatConstIterator'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a11c8b512e764c96c1e4ec6519df84503',1,'cv::MatConstIterator::MatConstIterator()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#adeb2d3232dd4fa391e9737d5ae079c33',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ac18a34a9c94f8a1f62a7f5e514c357be',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m, int _row, int _col=0)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a8dae0cd35279f7707dc8087374549c44',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m, Point _pt)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a1057d9eb074d77ff7b87566aebcb88b3',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m, const int *_idx)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a9635c2a5d18f3b875d98c8cef90fc9b5',1,'cv::MatConstIterator::MatConstIterator(const MatConstIterator &it)']]], - ['matconstiterator_5f_376',['MatConstIterator_',['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html',1,'cv::MatConstIterator_< _Tp >'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a452adcda3e2fb13eaf6f53456e6686e7',1,'cv::MatConstIterator_::MatConstIterator_()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#aeb5d9d2b765c182be0b731ff8bfedc11',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#aba7a798f9ea3adeb24dc358a60cac7a1',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m, int _row, int _col=0)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a6f2a3324d41f00c57f5f52bd2dc54356',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m, Point _pt)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ac3fcc7f48d7159e32d277bfcdf8bc485',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m, const int *_idx)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#aa8e7fdafb5cf5b8c7561477b3aebea33',1,'cv::MatConstIterator_::MatConstIterator_(const MatConstIterator_ &it)']]], - ['material_5fdiffuse_377',['MATERIAL_DIFFUSE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa168d81aafad40e07dbee4d6158be1db0',1,'cv::ovis::MATERIAL_DIFFUSE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa168d81aafad40e07dbee4d6158be1db0',1,'MATERIAL_DIFFUSE(Global Namespace)']]], - ['material_5femissive_378',['MATERIAL_EMISSIVE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aab4e1e8ad6c2625eeed92f18edba3b405',1,'cv::ovis::MATERIAL_EMISSIVE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aab4e1e8ad6c2625eeed92f18edba3b405',1,'MATERIAL_EMISSIVE(Global Namespace)']]], - ['material_5fline_5fwidth_379',['MATERIAL_LINE_WIDTH',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa20b84ae789e1989a24a67a5248dbca3b',1,'cv::ovis::MATERIAL_LINE_WIDTH'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa20b84ae789e1989a24a67a5248dbca3b',1,'MATERIAL_LINE_WIDTH(Global Namespace)']]], - ['material_5fopacity_380',['MATERIAL_OPACITY',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa338c9d0436bf767e82cab713d92af513',1,'cv::ovis::MATERIAL_OPACITY'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa338c9d0436bf767e82cab713d92af513',1,'MATERIAL_OPACITY(Global Namespace)']]], - ['material_5fpoint_5fsize_381',['MATERIAL_POINT_SIZE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aae70b278b28a11f386dad827d5cb7ed65',1,'cv::ovis::MATERIAL_POINT_SIZE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aae70b278b28a11f386dad827d5cb7ed65',1,'MATERIAL_POINT_SIZE(Global Namespace)']]], - ['material_5ftexture_382',['MATERIAL_TEXTURE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa31f70ed1b004bc4fa9ac7f3a11ab9907',1,'cv::ovis::MATERIAL_TEXTURE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa31f70ed1b004bc4fa9ac7f3a11ab9907',1,'MATERIAL_TEXTURE(Global Namespace)']]], - ['material_5ftexture0_383',['MATERIAL_TEXTURE0',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aafc0e368296f231ebe9a63a6537bde448',1,'cv::ovis::MATERIAL_TEXTURE0'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aafc0e368296f231ebe9a63a6537bde448',1,'MATERIAL_TEXTURE0(Global Namespace)']]], - ['material_5ftexture1_384',['MATERIAL_TEXTURE1',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aaab1a6ff1107ddafd430962038b564730',1,'cv::ovis::MATERIAL_TEXTURE1'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aaab1a6ff1107ddafd430962038b564730',1,'MATERIAL_TEXTURE1(Global Namespace)']]], - ['material_5ftexture2_385',['MATERIAL_TEXTURE2',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aaf94fc18d5fcf12e801f06b38ab66e2e3',1,'cv::ovis::MATERIAL_TEXTURE2'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aaf94fc18d5fcf12e801f06b38ab66e2e3',1,'MATERIAL_TEXTURE2(Global Namespace)']]], - ['material_5ftexture3_386',['MATERIAL_TEXTURE3',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aab9dc60eae5d97342078e8c170c9c3e22',1,'cv::ovis::MATERIAL_TEXTURE3'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aab9dc60eae5d97342078e8c170c9c3e22',1,'MATERIAL_TEXTURE3(Global Namespace)']]], - ['materialproperty_387',['MaterialProperty',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gaea70a6f274f75325488b51c14578620a',1,'cv::ovis::MaterialProperty'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gaea70a6f274f75325488b51c14578620a',1,'MaterialProperty(Global Namespace)']]], - ['matexpr_388',['MatExpr',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html',1,'cv::MatExpr'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a667e294461d09da9a1b1760d33adbbc8',1,'cv::MatExpr::MatExpr()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a18f051615e9350438ef369c9dca01e6a',1,'cv::MatExpr::MatExpr(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae38c3e856d93e7cffb9f14c894a76c17',1,'cv::MatExpr::MatExpr(const MatOp *_op, int _flags, const Mat &_a=Mat(), const Mat &_b=Mat(), const Mat &_c=Mat(), double _alpha=1, double _beta=1, const Scalar &_s=Scalar())']]], - ['math_20functions_389',['Catalog of coefficient-wise math functions',['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'']]], - ['math_20operations_390',['Graph API: Math operations',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html',1,'']]], - ['math_20with_20f0_20transform_20support_391',['Math with F0-transform support',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html',1,'']]], - ['math_20with_20f1_20transform_20support_392',['Math with F1-transform support',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html',1,'']]], - ['math_2eh_393',['math.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00011.html',1,'']]], - ['matheader_394',['MatHeader',['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html',1,'cv::gapi::own::detail::MatHeader'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a4c70f10de37911136c772a2a757c7330',1,'cv::gapi::own::detail::MatHeader::MatHeader()=default'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a96dd538e3f126b1345d1e51f26725f75',1,'cv::gapi::own::detail::MatHeader::MatHeader(int _rows, int _cols, int type, void *_data, size_t _step)'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a102f051bfd010997f96a90d8be931a9c',1,'cv::gapi::own::detail::MatHeader::MatHeader(const std::vector< int > &_dims, int type, void *_data)'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a1312f98f9299bba8f423babcab4cfb3a',1,'cv::gapi::own::detail::MatHeader::MatHeader(const MatHeader &)=default'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#adcb44c4766a33685aaf9550b4450d827',1,'cv::gapi::own::detail::MatHeader::MatHeader(MatHeader &&src)']]], - ['mathematical_20special_20functions_395',['Mathematical Special Functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html',1,'Mathematical Special Functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html',1,'Mathematical Special Functions']]], - ['mathematics_396',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], - ['matiterator_5f_397',['MatIterator_',['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html',1,'cv::MatIterator_< _Tp >'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a309c4d310a2feea6f2153ae163057554',1,'cv::MatIterator_::MatIterator_()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ae7e45a26abfc2e14887f63016a6f625e',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a2535ef5b07ad7eeb66c502802ed87cb4',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m, int _row, int _col=0)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a2819a88c03e10d4eb34e104360080b01',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m, Point _pt)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a58e15db8d9e0631fdfe4a397e11523f3',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m, const int *_idx)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a7a90a2116ed74e442d38959b31990bbf',1,'cv::MatIterator_::MatIterator_(const MatIterator_ &it)']]], - ['matmul_398',['matmul',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#affcfaf5b1087ec3359583a9a7a38f9f0',1,'cv::MatOp']]], - ['matmulderiv_399',['matMulDeriv',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga905541c1275852eabff7dbdfbc10d160',1,'cv::matMulDeriv()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga905541c1275852eabff7dbdfbc10d160',1,'matMulDeriv()(Global Namespace)']]], - ['matop_400',['MatOp',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html',1,'cv::MatOp'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ac6eeff02c5ef401a8c1dcd150551f004',1,'cv::MatOp::MatOp()']]], - ['matrices_401',['Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'Arithm Operations on Matrices'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'Core Operations on Matrices']]], - ['matrices_402',['matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'Graph API: Operations on matrices'],['https://docs.opencv.org/4.2.0/d7/d37/tutorial_mat_mask_operations.html',1,'Mask operations on matrices']]], - ['matrices_403',['Operations on Matrices',['https://docs.opencv.org/4.2.0/d5/d8e/group__cudaarithm.html',1,'']]], - ['matrices_404',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], - ['matrix_405',['Matrix',['https://eigen.tuxfamily.org/dox/TopicCustomizing_InheritingMatrix.html',1,'Inheriting from Matrix'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen::Matrix< class, _Rows, _Cols, _Options, _MaxRows, _MaxCols >']]], - ['matrix_406',['matrix',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ad122a1f67e7b1d20fd2cb511f2fe7d5d',1,'cv::Affine3::matrix'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ad122a1f67e7b1d20fd2cb511f2fe7d5d',1,'Affine3< float >::matrix'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#af01e9ea8087e390af8af453bbe4c276c',1,'Eigen::ArrayBase::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#af01e9ea8087e390af8af453bbe4c276c',1,'ArrayBase< ArrayWrapper< ExpressionType > >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'Eigen::RotationBase::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< AngleAxis< _Scalar >, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Derived, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Rotation2D< _Scalar >, 2 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a758fbaf6aa41a5493659aa0c9bfe0dcf',1,'Eigen::Transform::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a0ac079dc1995058cbbded553b8d4485c',1,'Eigen::Transform::matrix() const']]], - ['matrix_407',['Matrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Eigen::Matrix::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Eigen::Matrix::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Eigen::Matrix::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Eigen::Matrix::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Eigen::Matrix::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Eigen::Matrix::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Eigen::Matrix::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Eigen::Matrix::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Eigen::Matrix::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Eigen::Matrix::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Eigen::Matrix::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Eigen::Matrix::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Eigen::Matrix::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, 3, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, 3, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, 3, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, 3, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, 3, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, 3, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, 3, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Dim, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Dim, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Dim, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Dim, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Dim, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Dim, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Dynamic, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index rows, Index cols)']]], - ['matrix_20and_20array_20manipulation_408',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], - ['matrix_20and_20vector_20arithmetic_409',['Matrix and vector arithmetic',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixArithmetic.html',1,'']]], - ['matrix_20class_410',['The Matrix class',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixClass.html',1,'']]], - ['matrix_20decomposition_411',['matrix decomposition',['https://docs.opencv.org/4.2.0/d8/d0e/group__core__hal__interface__decomp__cholesky.html',1,'Cholesky matrix decomposition'],['https://docs.opencv.org/4.2.0/d5/d42/group__core__hal__interface__decomp__lu.html',1,'LU matrix decomposition'],['https://docs.opencv.org/4.2.0/db/d36/group__core__hal__interface__decomp__qr.html',1,'QR matrix decomposition'],['https://docs.opencv.org/4.2.0/dd/d2a/group__core__hal__interface__decomp__svd.html',1,'Singular value matrix decomposition']]], - ['matrix_20decompositions_412',['Inplace matrix decompositions',['https://eigen.tuxfamily.org/dox/group__InplaceDecomposition.html',1,'']]], - ['matrix_20free_20solvers_413',['Matrix-free solvers',['https://eigen.tuxfamily.org/dox/group__MatrixfreeSolverExample.html',1,'']]], - ['matrix_20manipulation_20via_20nullary_20expressions_414',['Matrix manipulation via nullary-expressions',['https://eigen.tuxfamily.org/dox/TopicCustomizing_NullaryExpr.html',1,'']]], - ['matrix_20manipulations_415',['Sparse matrix manipulations',['https://eigen.tuxfamily.org/dox/group__TutorialSparse.html',1,'']]], - ['matrix_20multiplication_416',['Matrix multiplication',['https://docs.opencv.org/4.2.0/d2/dab/group__core__hal__interface__matrix__multiplication.html',1,'']]], - ['matrix_20product_20expressions_417',['Writing efficient matrix product expressions',['https://eigen.tuxfamily.org/dox/TopicWritingEfficientProductExpression.html',1,'']]], - ['matrix_20reductions_418',['Matrix Reductions',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html',1,'']]], - ['matrix_20typedefs_419',['Global matrix typedefs',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html',1,'']]], - ['matrix_2eh_420',['matrix.h',['https://docs.opencv.org/4.2.0/dd/df4/matrix_8h.html',1,'']]], - ['matrix2_421',['Matrix2',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga73a2c673745de956e66d30ad61fd4a7e',1,'Eigen::Matrix2'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga73a2c673745de956e66d30ad61fd4a7e',1,'Matrix2(Global Namespace)']]], - ['matrix2x_422',['Matrix2X',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga9fc5afaeb88d6cd4f2503dd6127b1ba8',1,'Eigen::Matrix2X'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga9fc5afaeb88d6cd4f2503dd6127b1ba8',1,'Matrix2X(Global Namespace)']]], - ['matrix3_423',['Matrix3',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac3972e6cb0f56cccbe9e3946a7e494f8',1,'Eigen::QuaternionBase::Matrix3'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac3972e6cb0f56cccbe9e3946a7e494f8',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::Matrix3'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac3972e6cb0f56cccbe9e3946a7e494f8',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::Matrix3'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac3972e6cb0f56cccbe9e3946a7e494f8',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::Matrix3'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga6d61b8a0039eeb04e6faf382b8635a7a',1,'Eigen::Matrix3'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga6d61b8a0039eeb04e6faf382b8635a7a',1,'Matrix3(Global Namespace)']]], - ['matrix3x_424',['Matrix3X',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gab22d239b05eafe7ac235325d454e7530',1,'Eigen::Matrix3X'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gab22d239b05eafe7ac235325d454e7530',1,'Matrix3X(Global Namespace)']]], - ['matrix4_425',['Matrix4',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga946841161df693bb792644ba410aa0f0',1,'Eigen::Matrix4'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga946841161df693bb792644ba410aa0f0',1,'Matrix4(Global Namespace)']]], - ['matrix4x_426',['Matrix4X',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga93eea03ee4428402191f86ef2239975e',1,'Eigen::Matrix4X'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga93eea03ee4428402191f86ef2239975e',1,'Matrix4X(Global Namespace)']]], - ['matrix_3c_20complexscalar_2c_20colsatcompiletime_2c_201_2c_20options_20_26_28_7erowmajor_29_2c_20maxcolsatcompiletime_2c_201_20_3e_427',['Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20complexscalar_2c_20colsatcompiletime_2c_201_2c_20options_20_26_7erowmajor_2c_20maxcolsatcompiletime_2c_201_20_3e_428',['Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20complexscalar_2c_20rowsatcompiletime_2c_20colsatcompiletime_2c_20options_2c_20maxrowsatcompiletime_2c_20maxcolsatcompiletime_20_3e_429',['Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20dim_20_3e_430',['Matrix< dim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], - ['matrix_3c_20double_2c_20outputdim_2c_20outputdim_20_3e_431',['Matrix< double, outputDim, outputDim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], - ['matrix_3c_20double_2c_20outputdim_2c_20statedim_20_3e_432',['Matrix< double, outputDim, stateDim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], - ['matrix_3c_20double_2c_20statedim_2c_201_20_3e_433',['Matrix< double, stateDim, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], - ['matrix_3c_20double_2c_20statedim_2c_20inputdim_20_3e_434',['Matrix< double, stateDim, inputDim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], - ['matrix_3c_20double_2c_20statedim_2c_20outputdim_20_3e_435',['Matrix< double, stateDim, outputDim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], - ['matrix_3c_20double_2c_20statedim_2c_20statedim_20_3e_436',['Matrix< double, stateDim, stateDim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], - ['matrix_3c_20int_2c_201_2c_20matrixtype_3a_3acolsatcompiletime_20_3e_437',['Matrix< int, 1, MatrixType::ColsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20int_2c_20matrixtype_3a_3arowsatcompiletime_2c_201_20_3e_438',['Matrix< int, MatrixType::RowsAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20n_20_3e_439',['Matrix< N >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], - ['matrix_3c_20outputdim_20_3e_440',['Matrix< outputDim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], - ['matrix_3c_20realscalar_2c_20dynamic_2c_201_20_3e_441',['Matrix< RealScalar, Dynamic, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20realscalar_2c_20dynamic_2c_20dynamic_2c_20colmajor_20_3e_442',['Matrix< RealScalar, Dynamic, Dynamic, ColMajor >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_201_2c_20size_2c_20options_7crowmajor_2c_201_2c_20maxsize_20_3e_443',['Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_203_2c_201_20_3e_444',['Matrix< Scalar, 3, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_20ambientdimatcompiletime_2c_201_20_3e_445',['Matrix< Scalar, AmbientDimAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_20ambientdimatcompiletime_2c_201_2c_20options_20_3e_446',['Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_20colsatcompiletime_2c_201_2c_20options_20_26_7erowmajor_2c_20maxcolsatcompiletime_2c_201_20_3e_447',['Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_20colsatcompiletime_2c_20colsatcompiletime_2c_20matrixoptions_2c_20maxcolsatcompiletime_2c_20maxcolsatcompiletime_20_3e_448',['Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_20diagsizeatcompiletime_2c_20diagsizeatcompiletime_2c_20matrixoptions_2c_20maxdiagsizeatcompiletime_2c_20maxdiagsizeatcompiletime_20_3e_449',['Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_20dim_2c_201_20_3e_450',['Matrix< Scalar, Dim, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_20dynamic_2c_201_20_3e_451',['Matrix< Scalar, Dynamic, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_20index_28ambientdimatcompiletime_29_3d_3ddynamic_20_3f_20dynamic_20_3aindex_28ambientdimatcompiletime_29_2b1_2c_201_2c_20options_20_3e_452',['Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_20rowsatcompiletime_2c_201_2c_200_2c_20maxrowsatcompiletime_2c_201_20_3e_453',['Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_20rowsatcompiletime_2c_20rowsatcompiletime_2c_20matrixoptions_2c_20maxrowsatcompiletime_2c_20maxrowsatcompiletime_20_3e_454',['Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_20size_2c_20size_2c_20colmajor_2c_20maxcolsatcompiletime_2c_20maxcolsatcompiletime_20_3e_455',['Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20scalar_2c_20sizeminusone_2c_201_2c_20options_20_26_7erowmajor_2c_20maxsizeminusone_2c_201_20_3e_456',['Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20storageindex_2c_201_2c_20eigen_5fsize_5fmin_5fprefer_5fdynamic_28colsatcompiletime_2c_20rowsatcompiletime_29_2c_20rowmajor_2c_201_2c_20eigen_5fsize_5fmin_5fprefer_5ffixed_28maxcolsatcompiletime_2c_20maxrowsatcompiletime_29_3e_457',['Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20storageindex_2c_20dynamic_2c_201_20_3e_458',['Matrix< StorageIndex, Dynamic, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrix_3c_20storageindex_2c_20matrixtype_3a_3arowsatcompiletime_2c_201_20_3e_459',['Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], - ['matrixbase_460',['MatrixBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html',1,'Eigen']]], - ['matrixbase_20and_20other_20classes_461',['Extending MatrixBase (and other classes)',['https://eigen.tuxfamily.org/dox/TopicCustomizing_Plugins.html',1,'']]], - ['matrixbase_3c_20homogeneous_3c_20matrixtype_2c_20_5fdirection_20_3e_20_3e_462',['MatrixBase< Homogeneous< MatrixType, _Direction > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html',1,'']]], - ['matrixbase_3c_20solve_3c_20decomposition_2c_20rhstype_20_3e_20_3e_463',['MatrixBase< Solve< Decomposition, RhsType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html',1,'']]], - ['matrixfunction_464',['matrixFunction',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1a6cc9f734eb175e785a1118305245fc',1,'Eigen::MatrixBase::matrixFunction()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1a6cc9f734eb175e785a1118305245fc',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::matrixFunction()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1a6cc9f734eb175e785a1118305245fc',1,'MatrixBase< Solve< Decomposition, RhsType > >::matrixFunction()']]], - ['matrixh_465',['matrixH',['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a8e781d2e22a2304647bcf0ae913cc8ea',1,'Eigen::HessenbergDecomposition::matrixH()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a8e781d2e22a2304647bcf0ae913cc8ea',1,'HessenbergDecomposition< MatrixType >::matrixH()']]], - ['matrixl_466',['matrixL',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a7d1f1878505fd1862e6f2286d27ff09a',1,'Eigen::IncompleteCholesky::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#af0e6a0df5679873b42cf82a372dd8ddb',1,'Eigen::LDLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a7f4a3eedbf82e7ce2d6bf0dcd84cdfa3',1,'Eigen::LLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a80dfe1f4b4c8991252178de385e310bc',1,'Eigen::SimplicialLDLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a232f994f0106fa405c4066f7dbf81c95',1,'Eigen::SimplicialLLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a35df62f4c1f7ed32f6ac39d94701b9a8',1,'Eigen::SparseLU::matrixL()']]], - ['matrixldlt_467',['matrixLDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#aa5e0fd09dcd5251a8521fa248b95db0b',1,'Eigen::LDLT']]], - ['matrixllt_468',['matrixLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#af62881fc95c7e54a93b63c20f2c62b46',1,'Eigen::LLT']]], - ['matrixlu_469',['matrixLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#afea0b8fc707a9097d46fe358cb18bbff',1,'Eigen::FullPivLU::matrixLU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#abea0d7e51c5591a6db152eade0892d9c',1,'Eigen::PartialPivLU::matrixLU()']]], - ['matrixq_470',['matrixQ',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#ad26dd2d3c002939771d2375e4e051c28',1,'Eigen::FullPivHouseholderQR::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a346441e4902a58d43d698ac3da6ff791',1,'Eigen::HessenbergDecomposition::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a346441e4902a58d43d698ac3da6ff791',1,'HessenbergDecomposition< MatrixType >::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a212bc2f69ea4eff830fde70e209e40fb',1,'Eigen::RealQZ::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a212bc2f69ea4eff830fde70e209e40fb',1,'RealQZ< MatrixType >::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a348c5c00788b912c2bcb3e80be467877',1,'Eigen::SparseQR::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a4179a9d595d9bd58a649ef695b3db3c3',1,'Eigen::SPQR::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a000f7392eda930576ffd2af1fae54af2',1,'Eigen::Tridiagonalization::matrixQ()']]], - ['matrixqr_471',['matrixQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aa572ac050c8d4fadd4f08a87f6b1e62b',1,'Eigen::ColPivHouseholderQR::matrixQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aa572ac050c8d4fadd4f08a87f6b1e62b',1,'ColPivHouseholderQR< MatrixType >::matrixQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a9c16411e5d8f1fc634a5797018d5aa3e',1,'Eigen::FullPivHouseholderQR::matrixQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#ae837f2fb30099212c53b3042c7d699c9',1,'Eigen::HouseholderQR::matrixQR()']]], - ['matrixqtz_472',['matrixQTZ',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ad89e2529fc1a8721239d9b6be9613a69',1,'Eigen::CompleteOrthogonalDecomposition']]], - ['matrixr_473',['matrixR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a44c534d47bde6b67ce4b5247d142ef30',1,'Eigen::ColPivHouseholderQR::matrixR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a44c534d47bde6b67ce4b5247d142ef30',1,'ColPivHouseholderQR< MatrixType >::matrixR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#abe62644e0879b3e75836d63edf623899',1,'Eigen::SparseQR::matrixR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a99389f43e9eebe0b222e3b75318046e5',1,'Eigen::SPQR::matrixR()']]], - ['matrixs_474',['matrixS',['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ad24d7bf534afb55adaef00f00846adaf',1,'Eigen::RealQZ::matrixS()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ad24d7bf534afb55adaef00f00846adaf',1,'RealQZ< MatrixType >::matrixS()']]], - ['matrixt_475',['matrixT',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a806213f5c96ff765265f47067229586d',1,'Eigen::CompleteOrthogonalDecomposition::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#add3ab5ed83f7f2f06b79fa910a2d5684',1,'Eigen::ComplexSchur::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#add3ab5ed83f7f2f06b79fa910a2d5684',1,'ComplexSchur< MatrixType >::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a8dc963d8ea2a17df9d8d718e9e34d06f',1,'Eigen::RealQZ::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a8dc963d8ea2a17df9d8d718e9e34d06f',1,'RealQZ< MatrixType >::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#abb78996b43b8642a5f507415730445cb',1,'Eigen::RealSchur::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#abb78996b43b8642a5f507415730445cb',1,'RealSchur< MatrixType >::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a6eb5ef94b8b9bb013c0e69b6df56d0df',1,'Eigen::Tridiagonalization::matrixT()']]], - ['matrixtype_476',['MatrixType',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#ad61f6278843a601096276c9a72c0252f',1,'Eigen::ComplexEigenSolver::MatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a83acd180404ddaac8a678fa65a6b632b',1,'Eigen::EigenSolver::MatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#a56f4b9823bb9a267de3aaf48428cd247',1,'Eigen::GeneralizedEigenSolver::MatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a93a611350a7db9d1da18f2c828ecea9f',1,'Eigen::HessenbergDecomposition::MatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a93a611350a7db9d1da18f2c828ecea9f',1,'HessenbergDecomposition< MatrixType >::MatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a30f72ba46abc2bb3c7fa919c1078fc9c',1,'Eigen::Transform::MatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#add0f4b2216d0ea8ee0f7d8525deaf0a9',1,'Eigen::Tridiagonalization::MatrixType']]], - ['matrixu_477',['matrixU',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#afed8177cf9836f032d42bdb6c6bc6e01',1,'Eigen::ComplexSchur::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#afed8177cf9836f032d42bdb6c6bc6e01',1,'ComplexSchur< MatrixType >::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a54838a2e31e53bbe4dcb78b5e80c8484',1,'Eigen::LDLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a18a390f085567e650e8345cc7e7c0df8',1,'Eigen::LLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a85622ccbecff99c8933d21f0a22b22bb',1,'Eigen::RealSchur::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a85622ccbecff99c8933d21f0a22b22bb',1,'RealSchur< MatrixType >::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#ab486c0cd928c8b0c1c20c314f0963ad0',1,'Eigen::SimplicialLDLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a173073880c5fc17661b4505259de4aa1',1,'Eigen::SimplicialLLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a5aa9a62f8d2c593a5817f4bc77c3e276',1,'Eigen::SparseLU::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#afc7fe1546b0f6e1801b86f22f5664cb8',1,'Eigen::SVDBase::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#afc7fe1546b0f6e1801b86f22f5664cb8',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::matrixU()']]], - ['matrixv_478',['matrixV',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a245a453b5e7347f737295c23133238c4',1,'Eigen::SVDBase::matrixV()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a245a453b5e7347f737295c23133238c4',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::matrixV()']]], - ['matrixwrapper_479',['MatrixWrapper',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixWrapper.html',1,'Eigen']]], - ['matrixx_480',['MatrixX',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga8a779d79defc9f822fa6ff5869c2ba6b',1,'Eigen::MatrixX'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga8a779d79defc9f822fa6ff5869c2ba6b',1,'MatrixX(Global Namespace)']]], - ['matrixx2_481',['MatrixX2',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga1d162ebb520e589b3a5a5f4024aa3ae4',1,'Eigen::MatrixX2'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga1d162ebb520e589b3a5a5f4024aa3ae4',1,'MatrixX2(Global Namespace)']]], - ['matrixx3_482',['MatrixX3',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gacdb4b32de62bf47373eec29612b73657',1,'Eigen::MatrixX3'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gacdb4b32de62bf47373eec29612b73657',1,'MatrixX3(Global Namespace)']]], - ['matrixx4_483',['MatrixX4',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gabe35b438cb4f39d72092d1fbb16153b8',1,'Eigen::MatrixX4'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gabe35b438cb4f39d72092d1fbb16153b8',1,'MatrixX4(Global Namespace)']]], - ['matrixxpr_484',['MatrixXpr',['https://eigen.tuxfamily.org/dox/structEigen_1_1MatrixXpr.html',1,'Eigen']]], - ['matrixz_485',['matrixZ',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a4cd178f13aefe5189d4beeb3eb1c5897',1,'Eigen::CompleteOrthogonalDecomposition::matrixZ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a19a116383f11423179b4d8f316da6f67',1,'Eigen::RealQZ::matrixZ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a19a116383f11423179b4d8f316da6f67',1,'RealQZ< MatrixType >::matrixZ()']]], - ['matshape_486',['MatShape',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga8a9ab61770c140f0fa2880c90aeae832',1,'cv::dnn::MatShape'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga8a9ab61770c140f0fa2880c90aeae832',1,'MatShape(Global Namespace)']]], - ['matsize_487',['MatSize',['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html',1,'cv::MatSize'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a5e739605f00e00e40d5c0dca366c3fcd',1,'cv::MatSize::MatSize()']]], - ['matstep_488',['MatStep',['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html',1,'cv::MatStep'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a3ad7985df6dfb840590bb1442ed36e50',1,'cv::MatStep::MatStep()'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#ad38cde803142727c157a4b8050de2a16',1,'cv::MatStep::MatStep(size_t s)']]], - ['mattouiimage_489',['MatToUIImage',['https://docs.opencv.org/4.2.0/d2/d92/group__imgcodecs__ios.html#ga99a095c2334fd8bf933382f1cad12416',1,]]], - ['matx_490',['Matx',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], - ['matx_491',['MATX',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba52401c0e7c2c1bd3e55d86f06b529279',1,'cv::_InputArray']]], - ['matx_492',['Matx',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'cv::Matx::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'cv::Matx::Matx(_Tp v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'cv::Matx::Matx(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13, _Tp v14, _Tp v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'cv::Matx::Matx(const _Tp *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'cv::Matx::Matx(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'cv::Matx::Matx(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'cv::Matx::Matx(const Matx< _Tp, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< _Tp, cn, 1 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13, _Tp v14, _Tp v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< _Tp, cn, 1 >::Matx(const _Tp *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< _Tp, cn, 1 >::Matx(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 1, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 1, 3 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 1, 3 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 1, 3 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 1, 3 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 1, 3 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 2, 2 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 2, 2 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 2, 2 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 2, 2 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 2, 2 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 2, 2 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 2, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 2, 3 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 2, 3 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 2, 3 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 2, 3 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 2, 3 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 3, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 3, 3 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 3, 3 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 3, 3 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 3, 3 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 3, 3 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 3, 4 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 3, 4 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 3, 4 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 3, 4 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 3, 4 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 3, 4 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 4, 4 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 4, 4 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 4, 4 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 4, 4 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 4, 4 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 4, 4 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, cn, 1 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, cn, 1 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, cn, 1 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, cn, 1 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, cn, 1 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, cn, 1 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float, 2, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float, 2, 3 >::Matx(float v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float, 2, 3 >::Matx(float v0, float v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13, float v14, float v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float, 2, 3 >::Matx(const float *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float, 2, 3 >::Matx(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, l > &a, const Matx< float, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float, 2, 3 >::Matx(const Matx< float, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float, 3, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float, 3, 3 >::Matx(float v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float, 3, 3 >::Matx(float v0, float v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13, float v14, float v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float, 3, 3 >::Matx(const float *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float, 3, 3 >::Matx(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, l > &a, const Matx< float, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float, 3, 3 >::Matx(const Matx< float, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float, cn, 1 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float, cn, 1 >::Matx(float v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float, cn, 1 >::Matx(float v0, float v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13, float v14, float v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float, cn, 1 >::Matx(const float *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float, cn, 1 >::Matx(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, l > &a, const Matx< float, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float, cn, 1 >::Matx(const Matx< float, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float_type, 4, 4 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float_type, 4, 4 >::Matx(float_type v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9, float_type v10, float_type v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9, float_type v10, float_type v11, float_type v12, float_type v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9, float_type v10, float_type v11, float_type v12, float_type v13, float_type v14, float_type v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float_type, 4, 4 >::Matx(const float_type *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float_type, 4, 4 >::Matx(std::initializer_list< float_type >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, l > &a, const Matx< float_type, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, n, m > &a, Matx_TOp)']]], - ['matx_2ehpp_493',['matx.hpp',['https://docs.opencv.org/4.2.0/dc/d09/matx_8hpp.html',1,'']]], - ['matx12d_494',['Matx12d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2e67dac932ed81c0c90e3d658c0f7033',1,'cv::Matx12d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2e67dac932ed81c0c90e3d658c0f7033',1,'Matx12d(Global Namespace)']]], - ['matx12f_495',['Matx12f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3a2cc9d733bf60e0200fa46196805153',1,'cv::Matx12f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3a2cc9d733bf60e0200fa46196805153',1,'Matx12f(Global Namespace)']]], - ['matx13d_496',['Matx13d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga765ff587743f231c87ffa708f6f76b96',1,'cv::Matx13d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga765ff587743f231c87ffa708f6f76b96',1,'Matx13d(Global Namespace)']]], - ['matx13f_497',['Matx13f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0af99d4dbb40a817429f3039700f8a33',1,'cv::Matx13f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0af99d4dbb40a817429f3039700f8a33',1,'Matx13f(Global Namespace)']]], - ['matx14d_498',['Matx14d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3a3e911d56f0e29d34cca18548bfdbbf',1,'cv::Matx14d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3a3e911d56f0e29d34cca18548bfdbbf',1,'Matx14d(Global Namespace)']]], - ['matx14f_499',['Matx14f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf1a460d05e81b372d31b50169ec289d6',1,'cv::Matx14f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf1a460d05e81b372d31b50169ec289d6',1,'Matx14f(Global Namespace)']]], - ['matx16d_500',['Matx16d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3afc2be04e64e50bd58296878ec38a1b',1,'cv::Matx16d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3afc2be04e64e50bd58296878ec38a1b',1,'Matx16d(Global Namespace)']]], - ['matx16f_501',['Matx16f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7cf48157727556c640df2854f11ff91a',1,'cv::Matx16f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7cf48157727556c640df2854f11ff91a',1,'Matx16f(Global Namespace)']]], - ['matx21d_502',['Matx21d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga088ad84a55a0fa104ccb9f828dc38299',1,'cv::Matx21d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga088ad84a55a0fa104ccb9f828dc38299',1,'Matx21d(Global Namespace)']]], - ['matx21f_503',['Matx21f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga37e9c8ab7c9ccf91d4b512c656664886',1,'cv::Matx21f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga37e9c8ab7c9ccf91d4b512c656664886',1,'Matx21f(Global Namespace)']]], - ['matx22d_504',['Matx22d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga10d0d07f3ac00f086e0fc532790ccc8c',1,'cv::Matx22d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga10d0d07f3ac00f086e0fc532790ccc8c',1,'Matx22d(Global Namespace)']]], - ['matx22f_505',['Matx22f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8f480b4b705baac0f2bc1a7db43809ce',1,'cv::Matx22f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8f480b4b705baac0f2bc1a7db43809ce',1,'Matx22f(Global Namespace)']]], - ['matx23d_506',['Matx23d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga392a6836e5dbc164888f4e39c7d9d9af',1,'cv::Matx23d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga392a6836e5dbc164888f4e39c7d9d9af',1,'Matx23d(Global Namespace)']]], - ['matx23f_507',['Matx23f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaa52e0258d92b0ff1be1644b061e65f66',1,'cv::Matx23f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaa52e0258d92b0ff1be1644b061e65f66',1,'Matx23f(Global Namespace)']]], - ['matx31d_508',['Matx31d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga778f9bbae8b0fe95271de44ac24083b0',1,'cv::Matx31d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga778f9bbae8b0fe95271de44ac24083b0',1,'Matx31d(Global Namespace)']]], - ['matx31f_509',['Matx31f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1625ab2c70d7f06d259f245cb5f5f4f8',1,'cv::Matx31f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1625ab2c70d7f06d259f245cb5f5f4f8',1,'Matx31f(Global Namespace)']]], - ['matx32d_510',['Matx32d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0d13e4d37f158c9e3f2d3a047849e626',1,'cv::Matx32d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0d13e4d37f158c9e3f2d3a047849e626',1,'Matx32d(Global Namespace)']]], - ['matx32f_511',['Matx32f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga6d016ebac929fa7bb2fa4f3ebdb9e953',1,'cv::Matx32f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga6d016ebac929fa7bb2fa4f3ebdb9e953',1,'Matx32f(Global Namespace)']]], - ['matx33d_512',['Matx33d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaff0100a48f049fb15584a4a657eae838',1,'cv::Matx33d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaff0100a48f049fb15584a4a657eae838',1,'Matx33d(Global Namespace)']]], - ['matx33f_513',['Matx33f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga118a383f60581636c7c8ab180cbb155e',1,'cv::Matx33f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga118a383f60581636c7c8ab180cbb155e',1,'Matx33f(Global Namespace)']]], - ['matx34d_514',['Matx34d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2ac31d988d1a8b5fb959d395dba89890',1,'cv::Matx34d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2ac31d988d1a8b5fb959d395dba89890',1,'Matx34d(Global Namespace)']]], - ['matx34f_515',['Matx34f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaec7e9859876e96fe9ee16e01b6f359b1',1,'cv::Matx34f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaec7e9859876e96fe9ee16e01b6f359b1',1,'Matx34f(Global Namespace)']]], - ['matx41d_516',['Matx41d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gafb03ffa6748e6d6e53e997e4975c6404',1,'cv::Matx41d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gafb03ffa6748e6d6e53e997e4975c6404',1,'Matx41d(Global Namespace)']]], - ['matx41f_517',['Matx41f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga9a196e7bdf588d7c685edbb330f74423',1,'cv::Matx41f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga9a196e7bdf588d7c685edbb330f74423',1,'Matx41f(Global Namespace)']]], - ['matx43d_518',['Matx43d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7db1c513c2dfacc11b83ed8a8c500304',1,'cv::Matx43d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7db1c513c2dfacc11b83ed8a8c500304',1,'Matx43d(Global Namespace)']]], - ['matx43f_519',['Matx43f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gac6f34340fe75178e5a11a77150a3303d',1,'cv::Matx43f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gac6f34340fe75178e5a11a77150a3303d',1,'Matx43f(Global Namespace)']]], - ['matx44d_520',['Matx44d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga366070cdc95233a6b6db521dfd99e713',1,'cv::Matx44d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga366070cdc95233a6b6db521dfd99e713',1,'Matx44d(Global Namespace)']]], - ['matx44f_521',['Matx44f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaaccfdd6e633076501c97b6ba4e792f53',1,'cv::Matx44f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaaccfdd6e633076501c97b6ba4e792f53',1,'Matx44f(Global Namespace)']]], - ['matx61d_522',['Matx61d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga95ed8b37f47393d8d9a50d9571c7be48',1,'cv::Matx61d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga95ed8b37f47393d8d9a50d9571c7be48',1,'Matx61d(Global Namespace)']]], - ['matx61f_523',['Matx61f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga449bf946575de9dc943e74566a0c5e7e',1,'cv::Matx61f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga449bf946575de9dc943e74566a0c5e7e',1,'Matx61f(Global Namespace)']]], - ['matx66d_524',['Matx66d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gafeab5cbf4078b280e11c59338435cd5c',1,'cv::Matx66d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gafeab5cbf4078b280e11c59338435cd5c',1,'Matx66d(Global Namespace)']]], - ['matx66f_525',['Matx66f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf1482aa6880dc74dad16683fd0ecc11e',1,'cv::Matx66f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf1482aa6880dc74dad16683fd0ecc11e',1,'Matx66f(Global Namespace)']]], - ['matx_3c_20_5ftp_2c_20cn_2c_201_20_3e_526',['Matx< _Tp, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_201_2c_203_20_3e_527',['Matx< double, 1, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_202_2c_202_20_3e_528',['Matx< double, 2, 2 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_202_2c_203_20_3e_529',['Matx< double, 2, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_203_2c_203_20_3e_530',['Matx< double, 3, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_203_2c_204_20_3e_531',['Matx< double, 3, 4 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_204_2c_204_20_3e_532',['Matx< double, 4, 4 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_20cn_2c_201_20_3e_533',['Matx< double, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20float_2c_202_2c_203_20_3e_534',['Matx< float, 2, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20float_2c_203_2c_203_20_3e_535',['Matx< float, 3, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20float_2c_20cn_2c_201_20_3e_536',['Matx< float, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20float_5ftype_2c_204_2c_204_20_3e_537',['Matx< float_type, 4, 4 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20int_2c_20cn_2c_201_20_3e_538',['Matx< int, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matxcommainitializer_539',['MatxCommaInitializer',['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html',1,'cv::MatxCommaInitializer< _Tp, m, n >'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#ad6172873d5585f6f43d6c116739c3046',1,'cv::MatxCommaInitializer::MatxCommaInitializer()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#ad6172873d5585f6f43d6c116739c3046',1,'MatxCommaInitializer< _Tp, m, 1 >::MatxCommaInitializer()']]], - ['matxcommainitializer_3c_20_5ftp_2c_20m_2c_201_20_3e_540',['MatxCommaInitializer< _Tp, m, 1 >',['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html',1,'']]], - ['max_541',['Max',['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1cudev_1_1Max.html',1,'cv::cudev::Max< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a6c39e42a5db22f2ca934f5aedcb9985f',1,'Eigen::AlignedBox::Max']]], - ['max_542',['max',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6dff8b6e9105b6d817b493e7be157c90',1,'cv::MatExpr::max(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0326ec178e9d4ca09c54b6b488fb8021',1,'cv::MatExpr::max(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4a2fa0a37cba3f21b576ae4084757fba',1,'cv::MatExpr::max(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acb1ea96bb76c4014c399ef6ba536a7b0',1,'cv::MatExpr::max(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8ee69a65a23b73a176ab5ef9a6e5d5cb',1,'cv::MatExpr::max(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6dff8b6e9105b6d817b493e7be157c90',1,'cv::MatExpr::max(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0326ec178e9d4ca09c54b6b488fb8021',1,'cv::MatExpr::max(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4a2fa0a37cba3f21b576ae4084757fba',1,'cv::MatExpr::max(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acb1ea96bb76c4014c399ef6ba536a7b0',1,'cv::MatExpr::max(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8ee69a65a23b73a176ab5ef9a6e5d5cb',1,'cv::MatExpr::max(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/da/d81/structcv_1_1cudev_1_1numeric__limits_3_01bool_01_4.html#ac703275292abf4e807a214591bcdc2d8',1,'cv::cudev::numeric_limits< bool >::max()'],['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html#a975e4945dd32c2d4d81754a930de6b32',1,'cv::cudev::numeric_limits< double >::max()'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html#a4c00407dc7ea3ba6b40e4304029889a2',1,'cv::cudev::numeric_limits< float >::max()'],['https://docs.opencv.org/4.2.0/da/d4e/structcv_1_1cudev_1_1numeric__limits_3_01schar_01_4.html#aa062933ff7ca9cac2696d885e0a395eb',1,'cv::cudev::numeric_limits< schar >::max()'],['https://docs.opencv.org/4.2.0/d1/d8b/structcv_1_1cudev_1_1numeric__limits_3_01short_01_4.html#a20f0d37fa674c928c9511f6862a0cb4e',1,'cv::cudev::numeric_limits< short >::max()'],['https://docs.opencv.org/4.2.0/d3/dc7/structcv_1_1cudev_1_1numeric__limits_3_01uchar_01_4.html#a5ca8ea65e60c6da8c38058728816a00b',1,'cv::cudev::numeric_limits< uchar >::max()'],['https://docs.opencv.org/4.2.0/dd/d89/structcv_1_1cudev_1_1numeric__limits_3_01uint_01_4.html#a1a620ff9c217ea83b33e76a4402c59d9',1,'cv::cudev::numeric_limits< uint >::max()'],['https://docs.opencv.org/4.2.0/df/d47/structcv_1_1cudev_1_1numeric__limits_3_01ushort_01_4.html#a03563b99fdf8162fb1bdd44f26dce122',1,'cv::cudev::numeric_limits< ushort >::max()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3d08b6f078ecee3862aeb01bdf0ba8b9',1,'cv::softdouble::max()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6361d683afa3e472e06a0c2e80984f00',1,'cv::softfloat::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ae00d7ad063d15bb7162da61116552175',1,'gamma_distribution< double >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ae00d7ad063d15bb7162da61116552175',1,'gamma_distribution< result_type >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8e9cd7d4bb14de188ead958d3f1faeac',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae433f04f988a93f6e835d7cf7fbbde31',1,'normal_distribution< double >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae433f04f988a93f6e835d7cf7fbbde31',1,'normal_distribution< result_type >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#a14712b344c9472eb67d2973589ddf7f2',1,'std::bernoulli_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a3699dfeea620a15824d48f712df52b0c',1,'std::binomial_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#ae5cd7dd82c78d0383e64cd19e0234c86',1,'std::cauchy_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#ab4889a7bcb116a19e0815cf2fa250263',1,'std::chi_squared_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a9a70eb71021b6dd2b675e158d76833ef',1,'std::discard_block_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a3e8e124e8cdf1f8d18b1838a5d1c9728',1,'std::discrete_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#ac4d57abc4ee818a817139259105ef090',1,'std::exponential_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#ade74f06d6ad6c6f14c988fea1b63c1bb',1,'std::extreme_value_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a06d2101e5cda9129c6632e788fe7b9b8',1,'std::fisher_f_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ae00d7ad063d15bb7162da61116552175',1,'std::gamma_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a537ddec1681bac5e12dd0aab79983072',1,'std::geometric_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#abf1815a0f69ac213aeeac81d614371e2',1,'std::independent_bits_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#af334bf0422c2d5ef522e3dac8427d63a',1,'std::linear_congruential_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#ae51c9700b0c6168babb2abdf188e50d0',1,'std::lognormal_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8e9cd7d4bb14de188ead958d3f1faeac',1,'std::mersenne_twister_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#ab6d71a4f655a8dc7b6c15f86eed3c497',1,'std::negative_binomial_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae433f04f988a93f6e835d7cf7fbbde31',1,'std::normal_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#a27b481b529885d1b1b714c7fe69a1945',1,'std::numeric_limits::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a343aaa0cdc636a60b6e224055d9df438',1,'std::piecewise_constant_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a469645104ba3c002ed9ca944110dfe2a',1,'std::piecewise_linear_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#aaba081a4614ee3ff72039cae6a476267',1,'std::poisson_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a1d0bd67aff4969f4a202719edd2c4f5b',1,'std::shuffle_order_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a3aa9a19c585c414c605558b3af9a86ec',1,'std::student_t_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#aeea39effc4518e2236214b51cc0e9f93',1,'std::subtract_with_carry_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#aa54fab480296167c634342e2f0222ef7',1,'std::uniform_int_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#aa66df100cde48499a2ba6b2cca3d1554',1,'std::uniform_real_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4e66ea69757ab2d6193e385c919e6f71',1,'std::valarray::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#ab2f82c4a4ca1feff71630626710d865e',1,'std::weibull_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4e66ea69757ab2d6193e385c919e6f71',1,'valarray< size_t >::max()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a0e0a35eb40a9079468f447c1bab8a400',1,'Eigen::AlignedBox::max()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a987d516532b24fcadc34d2f501579c73',1,'Eigen::AlignedBox::max() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga78f988f6cfa6223610298cbd4f86ec66',1,'cv::max(const softfloat &a, const softfloat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga07f4a159313983528c74d5162a56fbc9',1,'cv::max(const softdouble &a, const softdouble &b)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gacc40fa15eac0fb83f8ca70b7cc0b588d',1,'cv::max(InputArray src1, InputArray src2, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad81c37ed0b0fd23ede0cefadbf04af44',1,'cv::max(const Mat &src1, const Mat &src2, Mat &dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6eefd595055bf1ea4ba3d12f70531511',1,'cv::max(const UMat &src1, const UMat &src2, UMat &dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gadb5dd3d870f10c0866035755b929b1e7',1,'cv::cuda::max()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7edae1e0cfcb34a59e251c9b330949',1,'cv::cudev::max(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff9681cddad025c92c98529215adacb',1,'cv::cudev::max(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6432d74919e90dbda4727df485d68878',1,'cv::cudev::max(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae250eaed4ac6113528a0590afe45b099',1,'cv::cudev::max(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bd06dc616da56d71d6f238772e921e',1,'cv::cudev::max(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd2a8c631c77af12548b22aaacebc87a',1,'cv::cudev::max(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf5c19898fc50d657385caeca1ca1ede',1,'cv::cudev::max(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3763f4140dbd3501a732882e48c5102c',1,'cv::cudev::max(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8946999942e013d38872e231417093a0',1,'cv::cudev::max(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db3b60a0cbe9bc77ad3e698954a9c18',1,'cv::cudev::max(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga634efcb854017039414da832695a2533',1,'cv::cudev::max(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4adf20946d2403cdc84854e778d03a9a',1,'cv::cudev::max(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9c563261c87743c5dab045a91a61c7c',1,'cv::cudev::max(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae17404884a5f0ef7eaf56225fb604fe6',1,'cv::cudev::max(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ce2d615591426d5adb4764996698b9',1,'cv::cudev::max(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bf33fe22d6e7efb9e5faacbba1c6a45',1,'cv::cudev::max(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf91add376317b3731608216f28ab963',1,'cv::cudev::max(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0053e35915c820454ea2264d4ee7613f',1,'cv::cudev::max(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62698a80e29b75ec8505358a3799936e',1,'cv::cudev::max(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bce6ab7cccef843a7c944bbdbf63b07',1,'cv::cudev::max(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b384425584ac7c2d34bdc057e5af65',1,'cv::cudev::max(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d199235971dff02dc2959f563d23308',1,'cv::cudev::max(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga327485d656538e5fa100c599c75a1e00',1,'cv::cudev::max(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a96f99c184fabb74382774232aa3a34',1,'cv::cudev::max(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1015f0bfdd3bb605e0e9d1fd147e1df4',1,'cv::cudev::max(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bd5ed74854a11a09051de2954f15ed5',1,'cv::cudev::max(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e265a5d6affec6d1afbd2ef5f14e06',1,'cv::cudev::max(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa886e0915a0f68093092573066797ad',1,'cv::cudev::max(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49797f16c920f5d36c3174510dec72ea',1,'cv::cudev::max(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70201802b3cf2254a774fcd6a556772c',1,'cv::cudev::max(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6460dd389b726df9bb0a7bcfbdc759de',1,'cv::cudev::max(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76dd5f19b86e2c63bbd784ce53d8c3d5',1,'cv::cudev::max(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20343d119b1183a8e2c86859ebf509a0',1,'cv::cudev::max(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17935472e8616fd215d00f74958ff148',1,'cv::cudev::max(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5ac8be6bbe25ea472a8b035ca898d4',1,'cv::cudev::max(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cf8fa19265b62e66cabe413af3e98af',1,'cv::cudev::max(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga365449d2ee70ebad2e967ded65012d9f',1,'cv::cudev::max(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe20c764e1d3494e66d66bb79edd752b',1,'cv::cudev::max(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6908e25c314e9a522c4b81cd3b11b0e6',1,'cv::cudev::max(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabea3829667cf61d6d87ff887a0b62656',1,'cv::cudev::max(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f137995b4f2d9eb06126a5cfdd0b50',1,'cv::cudev::max(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga108f8c6df21015b48c0599f93404be91',1,'cv::cudev::max(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb469b3fb7117158fcfab61b99dd18fa',1,'cv::cudev::max(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0acbba9ca0c69f0393eb530b2f3086dc',1,'cv::cudev::max(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f53bfb32250efe690ddf916e22abc28',1,'cv::cudev::max(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74726357f2915b6368219138b4025fcc',1,'cv::cudev::max(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13b69add5d5f7e0a7b08d70c58628078',1,'cv::cudev::max(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea3eb5bf693497dea32ded82af090fdd',1,'cv::cudev::max(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae109b4e7ada4529f21451575bd6abeb7',1,'cv::cudev::max(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga590088e5ce5ec5e4ed714b4cce952e7f',1,'cv::cudev::max(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31b2a6f5dd43d410fd15868e6c0f280a',1,'cv::cudev::max(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99cb5e202087eaa0b229d3cf230728d1',1,'cv::cudev::max(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb8f76636a19b20fcb0210361532c2c',1,'cv::cudev::max(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095daa3a23199e024436979238b6bbd',1,'cv::cudev::max(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga813e1d83b09e82844b86d1353a77d748',1,'cv::cudev::max(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3cb3bca7308191b5700f530fa34ca',1,'cv::cudev::max(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d59e76ba65008f3b6b6b24b94d29ef',1,'cv::cudev::max(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3448076586183d18e39c7974dd70c8',1,'cv::cudev::max(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b97852d88c33eb05ee8831f2092012f',1,'cv::cudev::max(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12a59c2315768e81cd56da5cae21f33c',1,'cv::cudev::max(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c50fae74b2eaf9f75402c6f3f815b4',1,'cv::cudev::max(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e080dce49fa6b5ea358a2258bb629c6',1,'cv::cudev::max(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga024f510b15b88ba5c7424f3d491e75b7',1,'cv::cudev::max(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fc9392d7d60b78635d0c74636408fa6',1,'cv::cudev::max(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2097bf067a2cd8b1fb3ca5a314002c34',1,'cv::cudev::max(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21d3728ff2ae2aa507b6126bbdd1504a',1,'cv::cudev::max(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae35a8be3fd1df938eb2434db4ff5d6e1',1,'cv::cudev::max(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52c58c71c1b59d7072442a8bd2b47bce',1,'cv::cudev::max(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a9e142727b6a1dda24772209649785',1,'cv::cudev::max(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8f9e1e0e8752a30a78603922dc17e01',1,'cv::cudev::max(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga611a70849906e1ae3c0aa9e756cfb8de',1,'cv::cudev::max(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57333c18e7c065708d6ac3a6f68f6df3',1,'cv::cudev::max(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7da28fa160b61ce66315922672f10592',1,'cv::cudev::max(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7415c5b61082b4b9c7c2122f269a1e60',1,'cv::cudev::max(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga226f005c8e0685c696bc3b340f2913a3',1,'cv::cudev::max(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7e33b43b4a4e457011d464eb94a5d96',1,'cv::cudev::max(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8288851d3304269c3ff9ae788264de83',1,'cv::cudev::max(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea853b43ad12529c0afecebe3e75f33a',1,'cv::cudev::max(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa798788a3437d78a74ca1dc04e4b832e',1,'cv::cudev::max(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga984b7fb4be9bcb23c751e79824907172',1,'cv::cudev::max(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2ae1b02759bc502a2f9f0e1918fa61c',1,'cv::cudev::max(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09d4d1ecf2a01d8a04bfb6faed58ca75',1,'cv::cudev::max(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ffe50e3856a9c0ef216c9c2cc8ef88',1,'cv::cudev::max(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ef1167e26453336dfc63d860a92f2',1,'cv::cudev::max(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga054b13d0e5d1196e5c64aeafc35eda9d',1,'cv::cudev::max(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b7e9961d85c9275ca9797e2a7d492b',1,'cv::cudev::max(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cc953644000cdd73756355d21f65035',1,'cv::cudev::max(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga798df13ec7d9c0bfd7e87e9205fbe20e',1,'cv::cudev::max(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0d3731aadd1cd52d1497476d249c411',1,'cv::cudev::max(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12ed50409cb498ca954657e6d56e0aef',1,'cv::cudev::max(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03bdb4845489b77a0ec85e7db2116d8b',1,'cv::cudev::max(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b0eef253e07a5d3c8eb891aa0150ab4',1,'cv::cudev::max(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac81a538d91716632a351a3315bb27a',1,'cv::cudev::max(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a344c714483b3b153d094e38ab69ab',1,'cv::cudev::max(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc2afd9d000eb685e979e691c41efd8',1,'cv::cudev::max(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6417ca2883d855805c090de4b04a92cf',1,'cv::cudev::max(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ad7e5cdef23ce3709ab800afdab3a6',1,'cv::cudev::max(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae90057ec7319796e7dcfd7af28027386',1,'cv::cudev::max(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga057d8e2732db88e8f676b2f638127717',1,'cv::cudev::max(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cf8fba0ece505e1b05405af25c6de92',1,'cv::cudev::max(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga464718ee489ad5f8e1c9b575e510dec0',1,'cv::cudev::max(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c5c137d283d4daacfba1473b10b5541',1,'cv::cudev::max(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2082fcc1d0c81f321f78c10583f9e088',1,'cv::cudev::max(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0f9db015b2f6295ac50e0981442eccf',1,'cv::cudev::max(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d3a74e6af64be7dfeffbc8242c24c21',1,'cv::cudev::max(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfc39d6227d9b78470d511a20f948807',1,'cv::cudev::max(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d901c104487bf31776724581aac418a',1,'cv::cudev::max(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e805de45dbf65b56e332ac2b64bc8c8',1,'cv::cudev::max(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3642852f0e37cc6b223048baedb89b23',1,'cv::cudev::max(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8954cb6a927557a3afcbe7f53a47d0f',1,'cv::cudev::max(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f2ab33db68c0db0ea3490da34d41f6',1,'cv::cudev::max(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9b2181ee4a6be9ea8de2da75f821d4b',1,'cv::cudev::max(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8a6a48caa4e6ec56a6df3cbf6ee88ad',1,'cv::cudev::max(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4114f5fa4b6a1defced1ff6f09e99a77',1,'cv::cudev::max(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga709da4137ee804a37a3bf9897f81a54f',1,'cv::cudev::max(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga745f7c1a67b75924005059bdadfad059',1,'cv::cudev::max(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23cd6e3768da75d63ee2c772721547b5',1,'cv::cudev::max(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3535e57152bb9bb870cc80641924d968',1,'cv::cudev::max(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac75fd5ed788efc158eadfad05909768b',1,'cv::cudev::max(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bc01dd4cae5bc8f5d0fbbe41894e38c',1,'cv::cudev::max(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedb902f8f075950428f149f3ae6e8368',1,'cv::cudev::max(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42077dd2a8bbd9426871e1e6100bb88a',1,'cv::cudev::max(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c461a61928c807cfcbb35e05328a9f',1,'cv::cudev::max(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53b91c1178649b59ce12e5b7e3cd9f3b',1,'cv::cudev::max(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78ce5713c65e22a601075d719a9c78bc',1,'cv::cudev::max(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c69369e7994b7c797c2c7e251111d3',1,'cv::cudev::max(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf02f0270ebf0e09528142c25810f089e',1,'cv::cudev::max(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7cf77af63bb9be60fbe892722e899',1,'cv::cudev::max(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga016da0e12302e3a9a75ac629fd4711a6',1,'cv::cudev::max(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab90a61e27bbf62122d6d1630791f69e0',1,'cv::cudev::max(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0052ef1d3ba6d7a3b9ab72ca6527a9d0',1,'cv::cudev::max(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga833b26b174d46e6eb2983a845389f414',1,'cv::cudev::max(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f23d4191d045b10de43a72d2b9e2ab',1,'cv::cudev::max(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b690732c1fc4757ef340044ecfc4489',1,'cv::cudev::max(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe962f22e136477e81f50bfe84c27369',1,'cv::cudev::max(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ee23973c69d923d4dc293194ced992',1,'cv::cudev::max(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e1f15f8dd8f0672a29b786211703d3e',1,'cv::cudev::max(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9860c259c810cab9f11ca560b7ed50',1,'cv::cudev::max(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32870871b640f6b22406ec31171a7316',1,'cv::cudev::max(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad63be246086568453d852849a3323420',1,'cv::cudev::max(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20aac3e422e4cb8c3b7e5e70c1d14423',1,'cv::cudev::max(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc21c02538e0d716e033a0f60bd07ed7',1,'cv::cudev::max(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa8424d806478f3ec1226b9de554a54',1,'cv::cudev::max(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0427ef988e84eb62ff762dc5ece814c6',1,'cv::cudev::max(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc917089df0cae9685a241d7410d0d37',1,'cv::cudev::max(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed2f554315d00fe5e6787519fa821c7',1,'cv::cudev::max(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b345faefa99feef763db27ada3d285',1,'cv::cudev::max(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga602d4e347cb5bb2d3e0eacc8a185ab64',1,'cv::cudev::max(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a9f8491e0461da68dacc563649708c',1,'cv::cudev::max(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafb5251a655b274d9ad94130f58de64c',1,'cv::cudev::max(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab87360125776b39906941203e1b01988',1,'cv::cudev::max(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8116d6776ef06f4ce0decc7e25bb5471',1,'cv::cudev::max(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d496f6f0b4656db91a8ca8e6c533c9',1,'cv::cudev::max(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13bcfe8e2f5abff4acd6bb4b2f600d77',1,'cv::cudev::max(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga936cf9ff339de81e4c74b518a0356fed',1,'cv::cudev::max(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1a4045b1aba6742c364d17b98249ce6',1,'cv::cudev::max(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0149a2b69e6f49dc2138fbce981230b',1,'cv::cudev::max(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf93df076678da531781417d10b9cbbf',1,'cv::cudev::max(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db835d025ae8e27f82dc4c951e54bef',1,'cv::cudev::max(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9a1fdaaac965358a6f82c190302c6bf',1,'cv::cudev::max(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fbfaa00be80acd28eea2d9597ef58fc',1,'cv::cudev::max(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfbe7499b071b13a107e80a187b44e18',1,'cv::cudev::max(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79aa095d6cb5bcf6580bdf2766f33ab9',1,'cv::cudev::max(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf786b3d507ec79af09f1ff37fa58525',1,'cv::cudev::max(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga371a082668f40b2910437b066d610194',1,'cv::cudev::max(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3dda6876d0ddb4a6cc7a91c52d76c08',1,'cv::cudev::max(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7211b847fa77ba43a4274ddbc97ebd',1,'cv::cudev::max(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga620a0b36ae5d9f37970db813f4e8dad6',1,'cv::cudev::max(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7ddc4d5890f821cb280d7425ce5c74',1,'cv::cudev::max(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8f397fce7b658287fd0719a7197036',1,'cv::cudev::max(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81a2eeb9b0dc3148e6e93b297fe4e7e0',1,'cv::cudev::max(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga475f92091db274dbbb70a7706d0d0c40',1,'cv::cudev::max(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga859fcb1f96519a0148e0286f77a98569',1,'cv::cudev::max(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4e298eee324f7998e2f9ad32fdc362',1,'cv::cudev::max(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fa4a50a11b12e71a4b5971db09daed7',1,'cv::cudev::max(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29fd18d8e44839d3003b25e7c2be9f88',1,'cv::cudev::max(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga432a2fa36fadc150cd6a2b953e68362e',1,'cv::cudev::max(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a0a22941a27212e0a2ce3ced4b6ce23',1,'cv::cudev::max(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37c1b4a34f412f4f9a3b151f13a73db0',1,'cv::cudev::max(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86216fa87809ccfc51828718c5c42431',1,'cv::cudev::max(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3ab9e4e16dc195499a754530f4e7696',1,'cv::cudev::max(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3caf6dbeefcc40b730b67f8a21584d47',1,'cv::cudev::max(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65ff60ad91763997812d3721ff9b4ce9',1,'cv::cudev::max(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0cd4e99dd1837208bb030e4de8239ba',1,'cv::cudev::max(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec0cfaea38a71f6439a84dd49181e73d',1,'cv::cudev::max(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73baf05ed230e047e8b1a4a2cc883168',1,'cv::cudev::max(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6e726e28a344d15ba4f74e9b3a624bf',1,'cv::cudev::max(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39231493f16b86d7850dde970bfc35de',1,'cv::cudev::max(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6c1b774c5b7a8e2dfd6f4ebb46329ab',1,'cv::cudev::max(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628a75ac09a15e078f60b2ff10091794',1,'cv::cudev::max(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8833c4e522d0818abcfbaed896c9830',1,'cv::cudev::max(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7feb89effc24d3e37cd28dbe3e7b645',1,'cv::cudev::max(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga727b7d3d95fff67e0a602255e3b31f1f',1,'cv::cudev::max(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga097408aee5dc871470963d6f0a1ff929',1,'cv::cudev::max(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e3c84204b34ce3d42a85a20fe00a57c',1,'cv::cudev::max(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e0f041f44d4dfe49cfd4b47a3f82377',1,'cv::cudev::max(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaac935d91a102285989be110a5acfeb',1,'cv::cudev::max(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9ab71229973969fae54bd11d59236e6',1,'cv::cudev::max(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad143763f595cbe3d51d5d0e024939f4c',1,'cv::cudev::max(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac468f9c2a30559c3c66a33fa44eb0618',1,'cv::cudev::max(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga0ff081ea80eb39a96389c16ac0f9e944',1,'cv::gapi::max()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gacc40fa15eac0fb83f8ca70b7cc0b588d',1,'max(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad81c37ed0b0fd23ede0cefadbf04af44',1,'max(const Mat &src1, const Mat &src2, Mat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6eefd595055bf1ea4ba3d12f70531511',1,'max(const UMat &src1, const UMat &src2, UMat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6361d683afa3e472e06a0c2e80984f00',1,'max()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga78f988f6cfa6223610298cbd4f86ec66',1,'max(const softfloat &a, const softfloat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga07f4a159313983528c74d5162a56fbc9',1,'max(const softdouble &a, const softdouble &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga0ff081ea80eb39a96389c16ac0f9e944',1,'max(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gadb5dd3d870f10c0866035755b929b1e7',1,'max(InputArray src1, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7edae1e0cfcb34a59e251c9b330949',1,'max(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff9681cddad025c92c98529215adacb',1,'max(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6432d74919e90dbda4727df485d68878',1,'max(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae250eaed4ac6113528a0590afe45b099',1,'max(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bd06dc616da56d71d6f238772e921e',1,'max(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd2a8c631c77af12548b22aaacebc87a',1,'max(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf5c19898fc50d657385caeca1ca1ede',1,'max(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3763f4140dbd3501a732882e48c5102c',1,'max(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8946999942e013d38872e231417093a0',1,'max(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db3b60a0cbe9bc77ad3e698954a9c18',1,'max(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga634efcb854017039414da832695a2533',1,'max(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4adf20946d2403cdc84854e778d03a9a',1,'max(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9c563261c87743c5dab045a91a61c7c',1,'max(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae17404884a5f0ef7eaf56225fb604fe6',1,'max(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ce2d615591426d5adb4764996698b9',1,'max(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bf33fe22d6e7efb9e5faacbba1c6a45',1,'max(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf91add376317b3731608216f28ab963',1,'max(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0053e35915c820454ea2264d4ee7613f',1,'max(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62698a80e29b75ec8505358a3799936e',1,'max(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bce6ab7cccef843a7c944bbdbf63b07',1,'max(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b384425584ac7c2d34bdc057e5af65',1,'max(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d199235971dff02dc2959f563d23308',1,'max(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga327485d656538e5fa100c599c75a1e00',1,'max(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a96f99c184fabb74382774232aa3a34',1,'max(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1015f0bfdd3bb605e0e9d1fd147e1df4',1,'max(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bd5ed74854a11a09051de2954f15ed5',1,'max(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e265a5d6affec6d1afbd2ef5f14e06',1,'max(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa886e0915a0f68093092573066797ad',1,'max(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49797f16c920f5d36c3174510dec72ea',1,'max(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70201802b3cf2254a774fcd6a556772c',1,'max(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6460dd389b726df9bb0a7bcfbdc759de',1,'max(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76dd5f19b86e2c63bbd784ce53d8c3d5',1,'max(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20343d119b1183a8e2c86859ebf509a0',1,'max(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17935472e8616fd215d00f74958ff148',1,'max(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5ac8be6bbe25ea472a8b035ca898d4',1,'max(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cf8fa19265b62e66cabe413af3e98af',1,'max(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga365449d2ee70ebad2e967ded65012d9f',1,'max(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe20c764e1d3494e66d66bb79edd752b',1,'max(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6908e25c314e9a522c4b81cd3b11b0e6',1,'max(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabea3829667cf61d6d87ff887a0b62656',1,'max(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f137995b4f2d9eb06126a5cfdd0b50',1,'max(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga108f8c6df21015b48c0599f93404be91',1,'max(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb469b3fb7117158fcfab61b99dd18fa',1,'max(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0acbba9ca0c69f0393eb530b2f3086dc',1,'max(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f53bfb32250efe690ddf916e22abc28',1,'max(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74726357f2915b6368219138b4025fcc',1,'max(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13b69add5d5f7e0a7b08d70c58628078',1,'max(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea3eb5bf693497dea32ded82af090fdd',1,'max(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae109b4e7ada4529f21451575bd6abeb7',1,'max(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga590088e5ce5ec5e4ed714b4cce952e7f',1,'max(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31b2a6f5dd43d410fd15868e6c0f280a',1,'max(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99cb5e202087eaa0b229d3cf230728d1',1,'max(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb8f76636a19b20fcb0210361532c2c',1,'max(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095daa3a23199e024436979238b6bbd',1,'max(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga813e1d83b09e82844b86d1353a77d748',1,'max(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3cb3bca7308191b5700f530fa34ca',1,'max(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d59e76ba65008f3b6b6b24b94d29ef',1,'max(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3448076586183d18e39c7974dd70c8',1,'max(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b97852d88c33eb05ee8831f2092012f',1,'max(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12a59c2315768e81cd56da5cae21f33c',1,'max(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c50fae74b2eaf9f75402c6f3f815b4',1,'max(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e080dce49fa6b5ea358a2258bb629c6',1,'max(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga024f510b15b88ba5c7424f3d491e75b7',1,'max(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fc9392d7d60b78635d0c74636408fa6',1,'max(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2097bf067a2cd8b1fb3ca5a314002c34',1,'max(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21d3728ff2ae2aa507b6126bbdd1504a',1,'max(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae35a8be3fd1df938eb2434db4ff5d6e1',1,'max(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52c58c71c1b59d7072442a8bd2b47bce',1,'max(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a9e142727b6a1dda24772209649785',1,'max(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8f9e1e0e8752a30a78603922dc17e01',1,'max(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga611a70849906e1ae3c0aa9e756cfb8de',1,'max(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57333c18e7c065708d6ac3a6f68f6df3',1,'max(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7da28fa160b61ce66315922672f10592',1,'max(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7415c5b61082b4b9c7c2122f269a1e60',1,'max(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga226f005c8e0685c696bc3b340f2913a3',1,'max(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7e33b43b4a4e457011d464eb94a5d96',1,'max(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8288851d3304269c3ff9ae788264de83',1,'max(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea853b43ad12529c0afecebe3e75f33a',1,'max(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa798788a3437d78a74ca1dc04e4b832e',1,'max(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga984b7fb4be9bcb23c751e79824907172',1,'max(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2ae1b02759bc502a2f9f0e1918fa61c',1,'max(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09d4d1ecf2a01d8a04bfb6faed58ca75',1,'max(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ffe50e3856a9c0ef216c9c2cc8ef88',1,'max(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ef1167e26453336dfc63d860a92f2',1,'max(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga054b13d0e5d1196e5c64aeafc35eda9d',1,'max(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b7e9961d85c9275ca9797e2a7d492b',1,'max(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cc953644000cdd73756355d21f65035',1,'max(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga798df13ec7d9c0bfd7e87e9205fbe20e',1,'max(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0d3731aadd1cd52d1497476d249c411',1,'max(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12ed50409cb498ca954657e6d56e0aef',1,'max(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03bdb4845489b77a0ec85e7db2116d8b',1,'max(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b0eef253e07a5d3c8eb891aa0150ab4',1,'max(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac81a538d91716632a351a3315bb27a',1,'max(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a344c714483b3b153d094e38ab69ab',1,'max(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc2afd9d000eb685e979e691c41efd8',1,'max(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6417ca2883d855805c090de4b04a92cf',1,'max(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ad7e5cdef23ce3709ab800afdab3a6',1,'max(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae90057ec7319796e7dcfd7af28027386',1,'max(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga057d8e2732db88e8f676b2f638127717',1,'max(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cf8fba0ece505e1b05405af25c6de92',1,'max(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga464718ee489ad5f8e1c9b575e510dec0',1,'max(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c5c137d283d4daacfba1473b10b5541',1,'max(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2082fcc1d0c81f321f78c10583f9e088',1,'max(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0f9db015b2f6295ac50e0981442eccf',1,'max(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d3a74e6af64be7dfeffbc8242c24c21',1,'max(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfc39d6227d9b78470d511a20f948807',1,'max(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d901c104487bf31776724581aac418a',1,'max(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e805de45dbf65b56e332ac2b64bc8c8',1,'max(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3642852f0e37cc6b223048baedb89b23',1,'max(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8954cb6a927557a3afcbe7f53a47d0f',1,'max(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f2ab33db68c0db0ea3490da34d41f6',1,'max(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9b2181ee4a6be9ea8de2da75f821d4b',1,'max(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8a6a48caa4e6ec56a6df3cbf6ee88ad',1,'max(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4114f5fa4b6a1defced1ff6f09e99a77',1,'max(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga709da4137ee804a37a3bf9897f81a54f',1,'max(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga745f7c1a67b75924005059bdadfad059',1,'max(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23cd6e3768da75d63ee2c772721547b5',1,'max(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3535e57152bb9bb870cc80641924d968',1,'max(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac75fd5ed788efc158eadfad05909768b',1,'max(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bc01dd4cae5bc8f5d0fbbe41894e38c',1,'max(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedb902f8f075950428f149f3ae6e8368',1,'max(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42077dd2a8bbd9426871e1e6100bb88a',1,'max(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c461a61928c807cfcbb35e05328a9f',1,'max(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53b91c1178649b59ce12e5b7e3cd9f3b',1,'max(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78ce5713c65e22a601075d719a9c78bc',1,'max(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c69369e7994b7c797c2c7e251111d3',1,'max(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf02f0270ebf0e09528142c25810f089e',1,'max(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7cf77af63bb9be60fbe892722e899',1,'max(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga016da0e12302e3a9a75ac629fd4711a6',1,'max(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab90a61e27bbf62122d6d1630791f69e0',1,'max(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0052ef1d3ba6d7a3b9ab72ca6527a9d0',1,'max(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga833b26b174d46e6eb2983a845389f414',1,'max(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f23d4191d045b10de43a72d2b9e2ab',1,'max(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b690732c1fc4757ef340044ecfc4489',1,'max(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe962f22e136477e81f50bfe84c27369',1,'max(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ee23973c69d923d4dc293194ced992',1,'max(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e1f15f8dd8f0672a29b786211703d3e',1,'max(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9860c259c810cab9f11ca560b7ed50',1,'max(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32870871b640f6b22406ec31171a7316',1,'max(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad63be246086568453d852849a3323420',1,'max(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20aac3e422e4cb8c3b7e5e70c1d14423',1,'max(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc21c02538e0d716e033a0f60bd07ed7',1,'max(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa8424d806478f3ec1226b9de554a54',1,'max(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0427ef988e84eb62ff762dc5ece814c6',1,'max(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc917089df0cae9685a241d7410d0d37',1,'max(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed2f554315d00fe5e6787519fa821c7',1,'max(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b345faefa99feef763db27ada3d285',1,'max(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga602d4e347cb5bb2d3e0eacc8a185ab64',1,'max(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a9f8491e0461da68dacc563649708c',1,'max(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafb5251a655b274d9ad94130f58de64c',1,'max(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab87360125776b39906941203e1b01988',1,'max(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8116d6776ef06f4ce0decc7e25bb5471',1,'max(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d496f6f0b4656db91a8ca8e6c533c9',1,'max(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13bcfe8e2f5abff4acd6bb4b2f600d77',1,'max(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga936cf9ff339de81e4c74b518a0356fed',1,'max(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1a4045b1aba6742c364d17b98249ce6',1,'max(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0149a2b69e6f49dc2138fbce981230b',1,'max(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf93df076678da531781417d10b9cbbf',1,'max(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db835d025ae8e27f82dc4c951e54bef',1,'max(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9a1fdaaac965358a6f82c190302c6bf',1,'max(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fbfaa00be80acd28eea2d9597ef58fc',1,'max(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfbe7499b071b13a107e80a187b44e18',1,'max(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79aa095d6cb5bcf6580bdf2766f33ab9',1,'max(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf786b3d507ec79af09f1ff37fa58525',1,'max(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga371a082668f40b2910437b066d610194',1,'max(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3dda6876d0ddb4a6cc7a91c52d76c08',1,'max(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7211b847fa77ba43a4274ddbc97ebd',1,'max(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga620a0b36ae5d9f37970db813f4e8dad6',1,'max(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7ddc4d5890f821cb280d7425ce5c74',1,'max(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8f397fce7b658287fd0719a7197036',1,'max(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81a2eeb9b0dc3148e6e93b297fe4e7e0',1,'max(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga475f92091db274dbbb70a7706d0d0c40',1,'max(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga859fcb1f96519a0148e0286f77a98569',1,'max(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4e298eee324f7998e2f9ad32fdc362',1,'max(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fa4a50a11b12e71a4b5971db09daed7',1,'max(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29fd18d8e44839d3003b25e7c2be9f88',1,'max(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga432a2fa36fadc150cd6a2b953e68362e',1,'max(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a0a22941a27212e0a2ce3ced4b6ce23',1,'max(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37c1b4a34f412f4f9a3b151f13a73db0',1,'max(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86216fa87809ccfc51828718c5c42431',1,'max(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3ab9e4e16dc195499a754530f4e7696',1,'max(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3caf6dbeefcc40b730b67f8a21584d47',1,'max(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65ff60ad91763997812d3721ff9b4ce9',1,'max(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0cd4e99dd1837208bb030e4de8239ba',1,'max(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec0cfaea38a71f6439a84dd49181e73d',1,'max(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73baf05ed230e047e8b1a4a2cc883168',1,'max(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6e726e28a344d15ba4f74e9b3a624bf',1,'max(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39231493f16b86d7850dde970bfc35de',1,'max(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6c1b774c5b7a8e2dfd6f4ebb46329ab',1,'max(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628a75ac09a15e078f60b2ff10091794',1,'max(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8833c4e522d0818abcfbaed896c9830',1,'max(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7feb89effc24d3e37cd28dbe3e7b645',1,'max(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga727b7d3d95fff67e0a602255e3b31f1f',1,'max(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga097408aee5dc871470963d6f0a1ff929',1,'max(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e3c84204b34ce3d42a85a20fe00a57c',1,'max(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e0f041f44d4dfe49cfd4b47a3f82377',1,'max(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaac935d91a102285989be110a5acfeb',1,'max(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9ab71229973969fae54bd11d59236e6',1,'max(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad143763f595cbe3d51d5d0e024939f4c',1,'max(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac468f9c2a30559c3c66a33fa44eb0618',1,'max(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#aa05dc1fa1f8a513888fd311ea7b39aa3',1,'__gnu_parallel::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga84d30d8c4b3f2cbe8ec2055c34a578da',1,'std::max(const _Tp &__a, const _Tp &__b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga2a22232a7bcd3b1f87a45a5fb01ac9c3',1,'std::max(const _Tp &__a, const _Tp &__b, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4e66ea69757ab2d6193e385c919e6f71',1,'max() const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga84d30d8c4b3f2cbe8ec2055c34a578da',1,'max(const _Tp &__a, const _Tp &__b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga2a22232a7bcd3b1f87a45a5fb01ac9c3',1,'max(const _Tp &__a, const _Tp &__b, _Compare __comp)(Global Namespace)']]], - ['max16s_543',['max16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66336453cd904ddef80b325b92626610',1,'cv::hal::max16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66336453cd904ddef80b325b92626610',1,'max16s()(Global Namespace)']]], - ['max16u_544',['max16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga601826ce6352e8b85eb260be8b85c7a6',1,'cv::hal::max16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga601826ce6352e8b85eb260be8b85c7a6',1,'max16u()(Global Namespace)']]], - ['max32f_545',['max32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga4652f0687a917b049d22a466adb4c18e',1,'cv::hal::max32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga4652f0687a917b049d22a466adb4c18e',1,'max32f()(Global Namespace)']]], - ['max32s_546',['max32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6738c923e01c515b9c3be8329adf5494',1,'cv::hal::max32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6738c923e01c515b9c3be8329adf5494',1,'max32s()(Global Namespace)']]], - ['max64f_547',['max64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9283f7d52b658ea4c9b59652d9f0a173',1,'cv::hal::max64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9283f7d52b658ea4c9b59652d9f0a173',1,'max64f()(Global Namespace)']]], - ['max8s_548',['max8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacc4819891df74719567179051e911e2b',1,'cv::hal::max8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacc4819891df74719567179051e911e2b',1,'max8s()(Global Namespace)']]], - ['max8u_549',['max8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac92f2f18733b6f8ac7692da669252906',1,'cv::hal::max8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac92f2f18733b6f8ac7692da669252906',1,'max8u()(Global Namespace)']]], - ['max_5f_550',['max_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41470dd8d5f61c2020ab8672a483838',1,'cv::cudev::max_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41470dd8d5f61c2020ab8672a483838',1,'max_()(Global Namespace)']]], - ['max_5fbucket_5fcount_551',['max_bucket_count',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af29f5a18a09a36adb720b6907e45eacd',1,'std::unordered_map::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a193e48c36ac0f5888911cf991428a287',1,'std::unordered_multimap::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#abc4c192168d4217376439dce87cf12a2',1,'std::unordered_multiset::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#afc90e16afa79bd929b49590dc8637b00',1,'std::unordered_set::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af29f5a18a09a36adb720b6907e45eacd',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_bucket_count()']]], - ['max_5fcount_552',['max_count',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#aa038f38231a225b4eae4b7a641cae9d0a7c66d09f76b308caa4430f2f04575835',1,'__gnu_pbds::lu_counter_policy']]], - ['max_5fdigits10_553',['max_digits10',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a1c62958a09eb69aba2a03a6e03b1574f',1,'std::__numeric_limits_base::max_digits10'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a1c62958a09eb69aba2a03a6e03b1574f',1,'std::numeric_limits::max_digits10']]], - ['max_5fdim_554',['MAX_DIM',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a56b3ce308d0a3e4929a96c65ff4d9914abe1aff4cd2b540afd5a3f4ffca3bd9a2',1,'cv::SparseMat']]], - ['max_5felement_555',['max_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6c310c6d1db64624d3097dd06838ef9b',1,'std::max_element(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gab0bc7a1a77eead2e4af61c6506230104',1,'std::max_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6c310c6d1db64624d3097dd06838ef9b',1,'max_element(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gab0bc7a1a77eead2e4af61c6506230104',1,'max_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], - ['max_5felement_5fminimal_5fn_556',['max_element_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ad032e9ab491119f763bfb79cbfcc24d8',1,'__gnu_parallel::_Settings']]], - ['max_5fexponent_557',['max_exponent',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ac68694be9c73ac6e36c3fe2ab1f18da4',1,'std::__numeric_limits_base::max_exponent'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ac68694be9c73ac6e36c3fe2ab1f18da4',1,'std::numeric_limits::max_exponent']]], - ['max_5fexponent10_558',['max_exponent10',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#afa984ea44c90b032e00779a960af64ff',1,'std::__numeric_limits_base::max_exponent10'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#afa984ea44c90b032e00779a960af64ff',1,'std::numeric_limits::max_exponent10']]], - ['max_5fiter_559',['MAX_ITER',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57a56ca2bc5cd06345060a1c1c66a8fc06e',1,'cv::TermCriteria']]], - ['max_5fload_5ffactor_560',['max_load_factor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae2f58d908f2e03656fce158550d9ba73',1,'std::unordered_map::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0584274b6378b6d962debbe96f5c5cb6',1,'std::unordered_map::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a72250fbcb87cc6ea4998eb8f00465650',1,'std::unordered_multimap::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#afea08a0d2315df4b6da1318c74be7114',1,'std::unordered_multimap::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a1d6af6a14a53c2709b072d6722ecf039',1,'std::unordered_multiset::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aff0cd0917d69025d995dd401c1ec63a6',1,'std::unordered_multiset::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ac182f2597af135950bfc3b1cd09575ec',1,'std::unordered_set::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a086929d624211470ff2b20a0ba23a86d',1,'std::unordered_set::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae2f58d908f2e03656fce158550d9ba73',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0584274b6378b6d962debbe96f5c5cb6',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_load_factor(float __z)']]], - ['max_5fm_561',['max_m',['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#ac6b386734baae252e9fbce2431315851',1,'cv::face::FacemarkAAM::Params::max_m'],['https://docs.opencv.org/4.2.0/db/d26/structcv_1_1face_1_1FacemarkAAM_1_1Model_1_1Texture.html#afc5d72e6384a0cb5f2182e8bd45e2c47',1,'cv::face::FacemarkAAM::Model::Texture::max_m']]], - ['max_5fn_562',['max_n',['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#ad28c713c2827875b85a7cb970cba2eed',1,'cv::face::FacemarkAAM::Params']]], - ['max_5fnum_5fobjects_5fin_5ftrack_563',['max_num_objects_in_track',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#acae65ec599c1fd89983b0438ea41ef90',1,'cv::tbm::TrackerParams']]], - ['max_5fpatch_5fsize_564',['max_patch_size',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#ad9f3a7e89e57ebc3243ea925b432a4e5',1,'cv::TrackerKCF::Params']]], - ['max_5fpixel_5fvalue_5fdefault_565',['MAX_PIXEL_VALUE_DEFAULT',['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#a54c4173ba0261974b97d60d0b697e2b3',1,'cv::quality::QualityPSNR']]], - ['max_5fprobability_5fancestor_566',['max_probability_ancestor',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a3fbe891fbba61bdb6a07e062c72510bd',1,'cv::text::ERStat']]], - ['max_5fsize_567',['max_size',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a5fdf0b0b785ed6eb4868aa5d587ead96',1,'cv::Allocator::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a29c306bcb6a7676a516430a0e50b990a',1,'__alloc_traits< _Tp_alloc_type >::max_size(const _Tp_alloc_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'__alloc_traits< _Tp_alloc_type >::max_size(const _Tp_alloc_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a29c306bcb6a7676a516430a0e50b990a',1,'__gnu_cxx::__alloc_traits::max_size(const _Alloc &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'__gnu_cxx::__alloc_traits::max_size(const _Alloc &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac8315ed08ac178584cf4a80ff4f7346a',1,'__gnu_cxx::__versa_string::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'__gnu_debug::basic_string::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'allocator_traits< _Tp_alloc_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< _CharT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< _CharT, _Traits, _Allocator >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< char >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< char, char_traits< char >, _Byte_alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< char_type, _Traits, _Alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< value_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5aea8252ed76805923d591f878768f67',1,'deque< _StateSeqT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac0642b1d26b07dcf28d5fd72bfbdd6d1',1,'list< __inp, __rebind_inp >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a586a8264c3ff903b6a2d66b245c3f88e',1,'match_results< _Bi_iter >::max_size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a586a8264c3ff903b6a2d66b245c3f88e',1,'match_results< _Bi_iter >::max_size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'std::allocator_traits::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a7d06983d84598768a8aa6458ac10738c',1,'std::allocator_traits< allocator< _Tp > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'std::basic_string::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5aea8252ed76805923d591f878768f67',1,'std::deque::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ae19c74808b1bc8e53bdc229fd3d389fa',1,'std::forward_list::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac0642b1d26b07dcf28d5fd72bfbdd6d1',1,'std::list::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#af2c022c3b246d7beb4c6eae4d6ce7ca2',1,'std::map::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a586a8264c3ff903b6a2d66b245c3f88e',1,'std::match_results::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a6c9a48e59ffb98b5afe9003861f1ddee',1,'std::multimap::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aec68936b69a9391df7ea268a7c44fb13',1,'std::multiset::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a84c5ddf1dff1dbdb8583cfabe3605b86',1,'std::set::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a70757335be624593a6bdf3c84d4895ee',1,'std::tr2::dynamic_bitset::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a695e48bcb2fa9e91ad07d3f7c45016dd',1,'std::unordered_map::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#accd0a24f61c8161dbd0fe216ead19142',1,'std::unordered_multimap::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af0cbbd14540e7875dd507533a959bf77',1,'std::unordered_multiset::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#afbad50ec9cd24208c2b33f35aa50f371',1,'std::unordered_set::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'std::vector::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a695e48bcb2fa9e91ad07d3f7c45016dd',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< __diff_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _CharClassT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _CharT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _Cmpt >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _Node *, _Nodeptr_Alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _RealType >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _State< _TraitsT::char_type > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _StringT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< block_type, allocator_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< Catalog_info * >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< double >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< int >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< result_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< size_t >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< std::pair< _BiIter, int > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< std::pair< _StateIdT, std::vector > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< std::pair< _StrTransT, _StrTransT > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< sub_match< _Bi_iter >, _Alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< sub_match< _BiIter >, _Alloc >::max_size()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a1b46c6631e30b8394e89bd1546d69736.html#a1b46c6631e30b8394e89bd1546d69736',1,'nlohmann::basic_json::max_size()']]], - ['maxarea_568',['maxArea',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a4fefafbf9b8d647f43c1e844d6c174d6',1,'cv::SimpleBlobDetector::Params']]], - ['maxcatcount_569',['maxCatCount',['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#a9460db994628b36f047b6365f37b07a1',1,'cv::CvFeatureParams']]], - ['maxcircularity_570',['maxCircularity',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a019186a4c99547810f0130802467b746',1,'cv::SimpleBlobDetector::Params']]], - ['maxclockfrequency_571',['maxClockFrequency',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2ad4a9905df7939ff4dbe1e1323155ef',1,'cv::ocl::Device']]], - ['maxcmlength_572',['maxCMLength',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a6ea07155a65e042b22f98fb0b1185fac',1,'cv::TrackerModel']]], - ['maxcoeff_573',['maxCoeff',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'Eigen::DenseBase::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'Eigen::DenseBase::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'Eigen::DenseBase::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'DenseBase< ArrayWrapper< ExpressionType > >::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'DenseBase< ArrayWrapper< ExpressionType > >::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'DenseBase< ArrayWrapper< ExpressionType > >::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'DenseBase< Solve< Decomposition, RhsType > >::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'DenseBase< Solve< Decomposition, RhsType > >::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'DenseBase< Solve< Decomposition, RhsType > >::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'Eigen::VectorwiseOp::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Derived, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Derived, Vertical >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::maxCoeff()']]], - ['maxcolsatcompiletime_574',['MaxColsAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dacc3a41000cf1d29dd1a320b2a09d2a65',1,'Eigen::DenseBase::MaxColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dacc3a41000cf1d29dd1a320b2a09d2a65',1,'DenseBase< ArrayWrapper< ExpressionType > >::MaxColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dacc3a41000cf1d29dd1a320b2a09d2a65',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::MaxColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dacc3a41000cf1d29dd1a320b2a09d2a65',1,'DenseBase< Solve< Decomposition, RhsType > >::MaxColsAtCompileTime']]], - ['maxcomputeunits_575',['maxComputeUnits',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a8cdbedf915935b8a3de00abcf0ff9669',1,'cv::ocl::Device']]], - ['maxconstantargs_576',['maxConstantArgs',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a1ab0e68f5c0ab2daa578f0b408f71353',1,'cv::ocl::Device']]], - ['maxconstantbuffersize_577',['maxConstantBufferSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#aa5ce4c19f0b23e5cad7ad9e55aef2e0c',1,'cv::ocl::Device']]], - ['maxconvexity_578',['maxConvexity',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#add498d1d21fee200964bb6682c29303e',1,'cv::SimpleBlobDetector::Params']]], - ['maxcorrectionbits_579',['maxCorrectionBits',['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a729196b33a1a678a82f01f8e15d7864b',1,'cv::aruco::Dictionary']]], - ['maxcount_580',['maxCount',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a35d5f474a78725a9b2a54c1c357b7a35',1,'cv::TermCriteria']]], - ['maxdepth_581',['maxDepth',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#aeb5d02172f4cb8089a71a860a6f7709f',1,'cv::rgbd::ICPOdometry::maxDepth'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a065b90e87ca51a0a20fc225539fd9504',1,'cv::rgbd::RgbdICPOdometry::maxDepth'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#ab13d0a93d6e4d510c43404fb143a370a',1,'cv::rgbd::RgbdOdometry::maxDepth']]], - ['maxdepthdiff_582',['maxDepthDiff',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#aecd843efaf58de7f7ae73db7f47247e7',1,'cv::rgbd::ICPOdometry::maxDepthDiff'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a45d9e421c99ae52ed99dbb2ed16fe7ca',1,'cv::rgbd::RgbdICPOdometry::maxDepthDiff'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a35953e9658b01038c6c99886f22d80d2',1,'cv::rgbd::RgbdOdometry::maxDepthDiff']]], - ['maxdistdiff_583',['maxDistDiff',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a4f118f933d22e17ddd5a8f9de6b1816a',1,'cv::rgbd::FastICPOdometry']]], - ['maxerroneousbitsinborderrate_584',['maxErroneousBitsInBorderRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a9d1e50a0e344152d6507e4b276abc281',1,'cv::aruco::DetectorParameters']]], - ['maxgridsize_585',['maxGridSize',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a0a1d357f595900f4ecdac350db7d672c',1,'cv::cuda::DeviceInfo']]], - ['maximum_586',['maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'Element-wise minimum or maximum'],['https://docs.opencv.org/4.2.0/d4/d31/structcv_1_1cudev_1_1maximum.html',1,'cv::cudev::maximum< class >']]], - ['maximum_3c_20double_20_3e_587',['maximum< double >',['https://docs.opencv.org/4.2.0/dc/d65/structcv_1_1cudev_1_1maximum_3_01double_01_4.html',1,'cv::cudev']]], - ['maximum_3c_20float_20_3e_588',['maximum< float >',['https://docs.opencv.org/4.2.0/d4/d1e/structcv_1_1cudev_1_1maximum_3_01float_01_4.html',1,'cv::cudev']]], - ['maximum_3c_20schar_20_3e_589',['maximum< schar >',['https://docs.opencv.org/4.2.0/df/df2/structcv_1_1cudev_1_1maximum_3_01schar_01_4.html',1,'cv::cudev']]], - ['maximum_3c_20short_20_3e_590',['maximum< short >',['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1maximum_3_01short_01_4.html',1,'cv::cudev']]], - ['maximum_3c_20uchar_20_3e_591',['maximum< uchar >',['https://docs.opencv.org/4.2.0/dc/d84/structcv_1_1cudev_1_1maximum_3_01uchar_01_4.html',1,'cv::cudev']]], - ['maximum_3c_20uint_20_3e_592',['maximum< uint >',['https://docs.opencv.org/4.2.0/d8/dfa/structcv_1_1cudev_1_1maximum_3_01uint_01_4.html',1,'cv::cudev']]], - ['maximum_3c_20ushort_20_3e_593',['maximum< ushort >',['https://docs.opencv.org/4.2.0/d0/dac/structcv_1_1cudev_1_1maximum_3_01ushort_01_4.html',1,'cv::cudev']]], - ['maxinertiaratio_594',['maxInertiaRatio',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#ac19c44f1166147eb321247984787f9d2',1,'cv::SimpleBlobDetector::Params']]], - ['maxiteration_595',['maxIteration',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#aa6a85c5e76ad2c398cf4dfb62a77ac68',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['maxiterations_596',['maxIterations',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a168a74c8dceb6233b220031fdd756ba0',1,'Eigen::IterativeSolverBase']]], - ['maxlevel_597',['maxLevel',['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#affd8a2aac0fd498ab04f587811acec6c',1,'cv::TrackerMedianFlow::Params::maxLevel'],['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a6eca27e3da61c48502db0299e852dd1d',1,'cv::optflow::RLOFOpticalFlowParameter::maxLevel'],['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html#aa1e49ada8bd3ff9eb22811a48ca3dc90',1,'cv::videostab::PyrLkOptFlowEstimatorBase::maxLevel() const']]], - ['maxlevel_5f_598',['maxLevel_',['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html#afbfdccf15125e25764a7366b1c2562ef',1,'cv::videostab::PyrLkOptFlowEstimatorBase']]], - ['maxmarkerperimeterrate_599',['maxMarkerPerimeterRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#aa5d26f7b2428a6b9499e33b007c66d5b',1,'cv::aruco::DetectorParameters']]], - ['maxmedianlengthofdisplacementdifference_600',['maxMedianLengthOfDisplacementDifference',['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#a61d27a22d05cde55d2d8a3d20be0ba49',1,'cv::TrackerMedianFlow::Params']]], - ['maxmemallocsize_601',['maxMemAllocSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a43a7ce355911b326d286ecaab3fb2e30',1,'cv::ocl::Device']]], - ['maxobjsize_602',['maxObjSize',['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#a36207faebbad7ce45c3dde9d37c9e5f4',1,'cv::DetectionBasedTracker::IDetector']]], - ['maxparametersize_603',['maxParameterSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0878eb6f7c3b8d9043e46d73a00137f3',1,'cv::ocl::Device']]], - ['maxpivot_604',['maxPivot',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aac8c43d720170980f582d01494df9e8f',1,'Eigen::ColPivHouseholderQR::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aac8c43d720170980f582d01494df9e8f',1,'ColPivHouseholderQR< MatrixType >::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a5b712a58c13b7e5089be9228ec42f738',1,'Eigen::CompleteOrthogonalDecomposition::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a7887506237a3bf912aebc9aaa8edacec',1,'Eigen::FullPivHouseholderQR::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#abced9f280f5fc49c2e62605c782b237b',1,'Eigen::FullPivLU::maxPivot()']]], - ['maxpointspart_605',['maxPointsPart',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a949f055f8ebc29ddf5a2c8d35b8552fc',1,'cv::rgbd::ICPOdometry::maxPointsPart'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a76b55cb57ba18a605c3da5927622f10e',1,'cv::rgbd::RgbdICPOdometry::maxPointsPart'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a0eb5274fa0f3abb2d105fa545e5d399b',1,'cv::rgbd::RgbdOdometry::maxPointsPart']]], - ['maxposbuffer_606',['maxPosBuffer',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a125bb5a98ca8d63f5d0ed5fac895b8af',1,'cv::cuda::SURF_CUDA']]], - ['maxreadimageargs_607',['maxReadImageArgs',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a5b3698f3adbd38f41531799ae54e1826',1,'cv::ocl::Device']]], - ['maxrectifieddistance_608',['maxRectifiedDistance',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a752a0bea3ac5fb2ab1ad695a13274199',1,'cv::CirclesGridFinderParameters']]], - ['maxrotation_609',['maxRotation',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#af845083029333e0684ef03e33eed2208',1,'cv::rgbd::ICPOdometry::maxRotation'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a8a27d345552b282b5de085320b8b2469',1,'cv::rgbd::RgbdICPOdometry::maxRotation'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a586a324c1d6c59f75b72f4dff6cc22b8',1,'cv::rgbd::RgbdOdometry::maxRotation']]], - ['maxrowsatcompiletime_610',['MaxRowsAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dad2baadea085372837b0e80dc93be1306',1,'Eigen::DenseBase::MaxRowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dad2baadea085372837b0e80dc93be1306',1,'DenseBase< ArrayWrapper< ExpressionType > >::MaxRowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dad2baadea085372837b0e80dc93be1306',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::MaxRowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dad2baadea085372837b0e80dc93be1306',1,'DenseBase< Solve< Decomposition, RhsType > >::MaxRowsAtCompileTime']]], - ['maxsamplers_611',['maxSamplers',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a88f1375b142fbed9b3fcf69ffd70289c',1,'cv::ocl::Device']]], - ['maxsize_612',['maxSize',['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html#aca4652bfbf2c3ea15a2c60828790e097',1,'cv::face::CParams::maxSize'],['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#abed50a3b4fb6efb9a9a05b7c55c0edc2',1,'INCVMemAllocator::maxSize()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#a312414baa9360f6a2928e5b8a4570e56',1,'NCVMemNativeAllocator::maxSize()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#a492aadf40fab71f92b24f679e9f6a677',1,'NCVMemStackAllocator::maxSize()']]], - ['maxsizeatcompiletime_613',['MaxSizeAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da3a459062d39cb34452518f5f201161d2',1,'Eigen::DenseBase::MaxSizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da3a459062d39cb34452518f5f201161d2',1,'DenseBase< ArrayWrapper< ExpressionType > >::MaxSizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da3a459062d39cb34452518f5f201161d2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::MaxSizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da3a459062d39cb34452518f5f201161d2',1,'DenseBase< Solve< Decomposition, RhsType > >::MaxSizeAtCompileTime']]], - ['maxsurface1d_614',['maxSurface1D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a260dccdd9395ca059b60d2c250a7b19d',1,'cv::cuda::DeviceInfo']]], - ['maxsurface1dlayered_615',['maxSurface1DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a2c6c2d86c79673e0f003f72999901e0b',1,'cv::cuda::DeviceInfo']]], - ['maxsurface2d_616',['maxSurface2D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a5c46713e52796df8de5cc0675545b591',1,'cv::cuda::DeviceInfo']]], - ['maxsurface2dlayered_617',['maxSurface2DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ab382770adf2533cf52a6ec8dfdeceefd',1,'cv::cuda::DeviceInfo']]], - ['maxsurface3d_618',['maxSurface3D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#add5a8209f3a0a244bca9ce602a3ca8b9',1,'cv::cuda::DeviceInfo']]], - ['maxsurfacecubemap_619',['maxSurfaceCubemap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a380277029eb0760f3cdd599fdd6d6a68',1,'cv::cuda::DeviceInfo']]], - ['maxsurfacecubemaplayered_620',['maxSurfaceCubemapLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a6d2514b8ea311750d6640cb0a09ee885',1,'cv::cuda::DeviceInfo']]], - ['maxtexture1d_621',['maxTexture1D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a7dadb9baaef83deb18a19340eff89efd',1,'cv::cuda::DeviceInfo']]], - ['maxtexture1dlayered_622',['maxTexture1DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a63595aa52127a5e101aa2bd05bf21213',1,'cv::cuda::DeviceInfo']]], - ['maxtexture1dlinear_623',['maxTexture1DLinear',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a6ca6a1f3ccffbe4bcd082bb051a84709',1,'cv::cuda::DeviceInfo']]], - ['maxtexture1dmipmap_624',['maxTexture1DMipmap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8400034f3a46ec994d5f0b2b3097994d',1,'cv::cuda::DeviceInfo']]], - ['maxtexture2d_625',['maxTexture2D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a99a188ab0931a15cd512a75e7fa448b5',1,'cv::cuda::DeviceInfo']]], - ['maxtexture2dgather_626',['maxTexture2DGather',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a91932040e2174937d7db801dc51e37e1',1,'cv::cuda::DeviceInfo']]], - ['maxtexture2dlayered_627',['maxTexture2DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a868a27580ea696306c83aa5da2fea496',1,'cv::cuda::DeviceInfo']]], - ['maxtexture2dlinear_628',['maxTexture2DLinear',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#afe9b3a92a9832c6a8f52f8a006b8f297',1,'cv::cuda::DeviceInfo']]], - ['maxtexture2dmipmap_629',['maxTexture2DMipmap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#abd1a87ff21e6ace392634e05403618b6',1,'cv::cuda::DeviceInfo']]], - ['maxtexture3d_630',['maxTexture3D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#aed437fa43c5294c1fbb3f909a535ca57',1,'cv::cuda::DeviceInfo']]], - ['maxtexturecubemap_631',['maxTextureCubemap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ab66a0f8545b5f2b0104c56fe1373451c',1,'cv::cuda::DeviceInfo']]], - ['maxtexturecubemaplayered_632',['maxTextureCubemapLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a7fa8dda4989ff180a91d2d55377eab56',1,'cv::cuda::DeviceInfo']]], - ['maxthreadsdim_633',['maxThreadsDim',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#acd6c9806faa5718ac6ce46cf7f94b1b0',1,'cv::cuda::DeviceInfo']]], - ['maxthreadsperblock_634',['maxThreadsPerBlock',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ac90a47955f85b4b9b082f6f211562aa9',1,'cv::cuda::DeviceInfo']]], - ['maxthreadspermultiprocessor_635',['maxThreadsPerMultiProcessor',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8f827f2c363f19c7167479793f246bfa',1,'cv::cuda::DeviceInfo']]], - ['maxthreshold_636',['maxThreshold',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#addd6c9f61049769bcc301005daf21637',1,'cv::SimpleBlobDetector::Params']]], - ['maxtracklifetime_637',['maxTrackLifetime',['https://docs.opencv.org/4.2.0/d4/d80/structcv_1_1DetectionBasedTracker_1_1Parameters.html#a1649612b6899747cff2afe8f88ec1510',1,'cv::DetectionBasedTracker::Parameters']]], - ['maxtranslation_638',['maxTranslation',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#ad45b6d1d2cc318a78292678a1bb63979',1,'cv::rgbd::ICPOdometry::maxTranslation'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#af2eba6314e7454dfb3edf3929714a60a',1,'cv::rgbd::RgbdICPOdometry::maxTranslation'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a3b021249d8f1a332cb794c9c18cc571a',1,'cv::rgbd::RgbdOdometry::maxTranslation']]], - ['maxtreedepth_639',['maxTreeDepth',['https://docs.opencv.org/4.2.0/d1/dcc/structcv_1_1optflow_1_1GPCTrainingParams.html#a1b60a97150c8b5f3aa926e04d17ad864',1,'cv::optflow::GPCTrainingParams']]], - ['maxunpoollayer_640',['MaxUnpoolLayer',['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html',1,'cv::dnn']]], - ['maxval_641',['maxVal',['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a46c726cefa11ac616833ee3b67192acb',1,'cv::ml::ParamGrid::maxVal'],['https://docs.opencv.org/4.2.0/df/df5/structcv_1_1cudev_1_1ThreshBinaryFunc.html#a21509e9dd4b337e5c875c0703a0474e6',1,'cv::cudev::ThreshBinaryFunc::maxVal'],['https://docs.opencv.org/4.2.0/da/d5e/structcv_1_1cudev_1_1ThreshBinaryInvFunc.html#a0e2b89709a39dccdd53caa89c49bc073',1,'cv::cudev::ThreshBinaryInvFunc::maxVal']]], - ['maxval_5f_642',['maxVal_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84304ffdf1361fe076ec78d18d9b9e49',1,'cv::cudev::maxVal_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84304ffdf1361fe076ec78d18d9b9e49',1,'maxVal_()(Global Namespace)']]], - ['maxvalue_643',['maxValue',['https://docs.opencv.org/4.2.0/dc/dcd/classcv_1_1dnn_1_1ReLU6Layer.html#af51250f90f35f29f6b136da4db890f5c',1,'cv::dnn::ReLU6Layer']]], - ['maxworkgroupsize_644',['maxWorkGroupSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#afd60a223663d5b4951d585e9f167d54f',1,'cv::ocl::Device']]], - ['maxworkitemdims_645',['maxWorkItemDims',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a6c76e7f57a273ea51e3564a4f1269158',1,'cv::ocl::Device']]], - ['maxworkitemsizes_646',['maxWorkItemSizes',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a693878609398a5edafad71026661e41f',1,'cv::ocl::Device']]], - ['maxwriteimageargs_647',['maxWriteImageArgs',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#afc62c78591b741fdca19a729867686ca',1,'cv::ocl::Device']]], - ['mctkernel_648',['MCTKernel',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html',1,'cv::stereo::MCTKernel< num_images >'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a377cbc392538c3039bec7de2bb08f9cd',1,'cv::stereo::MCTKernel::MCTKernel()'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a84d81c259c0c425e804e8ecfa58e9970',1,'cv::stereo::MCTKernel::MCTKernel(uint8_t **images, int threshold)']]], - ['mdeg_5fhi_649',['mdeg_hi',['../structrobot_1_1potparams__t.html#aaccebb6ae121edbf0a82d1d148d5f1b3',1,'robot::potparams_t']]], - ['mdeg_5flo_650',['mdeg_lo',['../structrobot_1_1potparams__t.html#ae13661659fc4f1e0409529632325e025',1,'robot::potparams_t']]], - ['mean_651',['mean',['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a1bca9d1cc7808b7d08b2a046ee92cd11',1,'cv::PCA::mean'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abcc6e9b8ff25f5d1e076cb5f51f42231',1,'normal_distribution< double >::mean()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abcc6e9b8ff25f5d1e076cb5f51f42231',1,'normal_distribution< result_type >::mean()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abcc6e9b8ff25f5d1e076cb5f51f42231',1,'std::normal_distribution::mean()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a92604e5687496c6efcc7148840fb478c',1,'std::poisson_distribution::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'Eigen::DenseBase::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'DenseBase< ArrayWrapper< ExpressionType > >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'DenseBase< Solve< Decomposition, RhsType > >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'Eigen::VectorwiseOp::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Derived, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Derived, Vertical >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::mean()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga191389f8a0e58180bb13a727782cd461',1,'cv::mean()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa37ea1b811bcc3e26ee1b3fb00acc55c',1,'cv::gapi::mean()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga191389f8a0e58180bb13a727782cd461',1,'mean(InputArray src, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa37ea1b811bcc3e26ee1b3fb00acc55c',1,'mean(const GMat &src)(Global Namespace)']]], - ['meanandvariancealongrows_652',['meanAndVarianceAlongRows',['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga10bf67ff702c28406312748f905863ec',1,'cv::sfm::meanAndVarianceAlongRows()'],['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga10bf67ff702c28406312748f905863ec',1,'meanAndVarianceAlongRows()(Global Namespace)']]], - ['meankernelintegralimage_653',['MeanKernelIntegralImage',['https://docs.opencv.org/4.2.0/de/d9b/classcv_1_1stereo_1_1MeanKernelIntegralImage.html',1,'cv::stereo::MeanKernelIntegralImage'],['https://docs.opencv.org/4.2.0/de/d9b/classcv_1_1stereo_1_1MeanKernelIntegralImage.html#a4a35ad65bd56ee5110cde92a40bb6ca7',1,'cv::stereo::MeanKernelIntegralImage::MeanKernelIntegralImage()']]], - ['means_20clustering_654',['Means Clustering',['https://docs.opencv.org/4.2.0/d9/d70/tutorial_py_kmeans_index.html',1,'K-Means Clustering'],['https://docs.opencv.org/4.2.0/de/d4d/tutorial_py_kmeans_understanding.html',1,'Understanding K-Means Clustering']]], - ['means_20clustering_20in_20opencv_655',['K-Means Clustering in OpenCV',['https://docs.opencv.org/4.2.0/d1/d5c/tutorial_py_kmeans_opencv.html',1,'']]], - ['meanshift_656',['meanShift',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga432a563c94eaf179533ff1e83dbb65ea',1,'cv::meanShift()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga432a563c94eaf179533ff1e83dbb65ea',1,'meanShift(InputArray probImage, Rect &window, TermCriteria criteria)(Global Namespace)']]], - ['meanshift_20and_20camshift_657',['Meanshift and Camshift',['https://docs.opencv.org/4.2.0/d7/d00/tutorial_meanshift.html',1,'Meanshift and Camshift'],['https://docs.opencv.org/4.2.0/db/df8/tutorial_py_meanshift.html',1,'Meanshift and Camshift'],['https://docs.opencv.org/4.2.0/df/def/tutorial_js_meanshift.html',1,'Meanshift and Camshift']]], - ['meanshift_2emarkdown_658',['meanshift.markdown',['https://docs.opencv.org/4.2.0/d5/d2a/meanshift_8markdown.html',1,'']]], - ['meanshiftfiltering_659',['meanShiftFiltering',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gae13b3035bc6df0e512d876dbb8c00555',1,'cv::cuda::meanShiftFiltering()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gae13b3035bc6df0e512d876dbb8c00555',1,'meanShiftFiltering()(Global Namespace)']]], - ['meanshiftproc_660',['meanShiftProc',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga6039dc8ecbe2f912bc83fcc9b3bcca39',1,'cv::cuda::meanShiftProc()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga6039dc8ecbe2f912bc83fcc9b3bcca39',1,'meanShiftProc()(Global Namespace)']]], - ['meanshiftsegmentation_661',['meanShiftSegmentation',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga70ed80533a448829dc48cf22b1845c16',1,'cv::cuda::meanShiftSegmentation()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga70ed80533a448829dc48cf22b1845c16',1,'meanShiftSegmentation()(Global Namespace)']]], - ['meanstddev_662',['meanStdDev',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga846c858f4004d59493d7c6a4354b301d',1,'cv::meanStdDev()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga990a4db4c6d7e8f0f3a6685ba48fbddc',1,'cv::cuda::meanStdDev(InputArray mtx, Scalar &mean, Scalar &stddev)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac0e8dc0bb32fda5afd32de0f18817587',1,'cv::cuda::meanStdDev(InputArray mtx, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga846c858f4004d59493d7c6a4354b301d',1,'meanStdDev(InputArray src, OutputArray mean, OutputArray stddev, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga990a4db4c6d7e8f0f3a6685ba48fbddc',1,'meanStdDev(InputArray mtx, Scalar &mean, Scalar &stddev)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac0e8dc0bb32fda5afd32de0f18817587',1,'meanStdDev(InputArray mtx, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['measurement_663',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], - ['measurement_20and_20improvement_20techniques_664',['Performance Measurement and Improvement Techniques',['https://docs.opencv.org/4.2.0/dc/d71/tutorial_py_optimization.html',1,'']]], - ['measurement_20with_20opencv_665',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], - ['measurementfunction_666',['measurementFunction',['https://docs.opencv.org/4.2.0/da/d2b/classcv_1_1tracking_1_1UkfSystemModel.html#ae8f272725272a23cc45dee75fb65349d',1,'cv::tracking::UkfSystemModel']]], - ['measurementmatrix_667',['measurementMatrix',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a0f60b78726d8eccf74a1f2479c2d1f97',1,'cv::KalmanFilter']]], - ['measurementnoisecov_668',['measurementNoiseCov',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a828d051035ba807966ad65edf288a08e',1,'cv::KalmanFilter::measurementNoiseCov'],['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a58d639ff6b3e3d64502b067b89214402',1,'cv::tracking::UnscentedKalmanFilterParams::measurementNoiseCov']]], - ['med_5fcrossings_669',['med_crossings',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a3acd75476c774c25b874b0aab2531ec2',1,'cv::text::ERStat']]], - ['media_20highgui_20module_670',['High Level GUI and Media (highgui module)',['https://docs.opencv.org/4.2.0/d0/de2/tutorial_table_of_content_highgui.html',1,'']]], - ['median1x9filter_671',['Median1x9Filter',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a4bdb66993689eb64dcb63f8b81c6046c',1,'cv::stereo::Matching']]], - ['median9x1filter_672',['Median9x1Filter',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#ac2a8d29abd0681427dbaac6819e88b11',1,'cv::stereo::Matching']]], - ['medianblur_673',['medianBlur',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga564869aa33e58769b4469101aac458f9',1,'cv::medianBlur()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga90c28c4986e8117ecb1b61300ff3e7e8',1,'cv::gapi::medianBlur()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga564869aa33e58769b4469101aac458f9',1,'medianBlur(InputArray src, OutputArray dst, int ksize)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga90c28c4986e8117ecb1b61300ff3e7e8',1,'medianBlur(const GMat &src, int ksize)(Global Namespace)']]], - ['mem_5ffn_674',['mem_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html#gadd917dd05154842bc6aebcf5c90abb7f',1,'std::mem_fn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html#gadd917dd05154842bc6aebcf5c90abb7f',1,'mem_fn()(Global Namespace)']]], - ['mem_5ffun1_5fref_5ft_675',['mem_fun1_ref_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07643.html',1,'std']]], - ['mem_5ffun1_5ft_676',['mem_fun1_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07635.html',1,'std']]], - ['mem_5ffun_5fref_5ft_677',['mem_fun_ref_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07627.html',1,'std']]], - ['mem_5ffun_5ft_678',['mem_fun_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07619.html',1,'std']]], - ['membaseaddralign_679',['memBaseAddrAlign',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ad13666f3a1309fd46afddeee390049d1',1,'cv::ocl::Device']]], - ['member_5ftype_680',['member_type',['https://docs.opencv.org/4.2.0/db/d0d/structcv_1_1ParamType_3_01__Tp_00_01typename_01std_1_1enable__if_3_01std_1_1is__enum_3_01__Tp_01_4_1_1value_01_4_1_1type_01_4.html#a0742037bb334272b50f79529057a6bdd',1,'cv::ParamType< _Tp, typename std::enable_if< std::is_enum< _Tp >::value >::type >::member_type'],['https://docs.opencv.org/4.2.0/d2/d39/structcv_1_1ParamType_3_01Algorithm_01_4.html#a5a4291ac78bc1fe7d3d13ed9ef4e5c36',1,'cv::ParamType< Algorithm >::member_type'],['https://docs.opencv.org/4.2.0/d1/d87/structcv_1_1ParamType_3_01bool_01_4.html#a964f22530bde824b0e0b235910a24861',1,'cv::ParamType< bool >::member_type'],['https://docs.opencv.org/4.2.0/d4/d98/structcv_1_1ParamType_3_01double_01_4.html#a6794ef3ad81ebde269e87cbd525346f3',1,'cv::ParamType< double >::member_type'],['https://docs.opencv.org/4.2.0/dd/df2/structcv_1_1ParamType_3_01float_01_4.html#ac43101978b056f5e4df09e46d0f028ba',1,'cv::ParamType< float >::member_type'],['https://docs.opencv.org/4.2.0/db/d5f/structcv_1_1ParamType_3_01Mat_01_4.html#a64a15830a193000b5313eee5f956a8f4',1,'cv::ParamType< Mat >::member_type'],['https://docs.opencv.org/4.2.0/d2/dda/structcv_1_1ParamType_3_01Scalar_01_4.html#a208d9d406c54735de6340378877c7d22',1,'cv::ParamType< Scalar >::member_type'],['https://docs.opencv.org/4.2.0/dc/d1c/structcv_1_1ParamType_3_01std_1_1vector_3_01Mat_01_4_01_4.html#a4888173117027981f98e76c7fd1b1cfe',1,'cv::ParamType< std::vector< Mat > >::member_type'],['https://docs.opencv.org/4.2.0/d0/d5f/structcv_1_1ParamType_3_01String_01_4.html#ac2b64e3e485f29a294945fca9c3f056e',1,'cv::ParamType< String >::member_type'],['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1ParamType_3_01uchar_01_4.html#a54a369a0c03aeb81c490b95cd4988d33',1,'cv::ParamType< uchar >::member_type'],['https://docs.opencv.org/4.2.0/dc/d63/structcv_1_1ParamType_3_01uint64_01_4.html#a898892dcc53b03d30896d17362b86bd0',1,'cv::ParamType< uint64 >::member_type'],['https://docs.opencv.org/4.2.0/d7/d68/structcv_1_1ParamType_3_01unsigned_01_4.html#a4077fed0defda475e5a7f94dc0f43471',1,'cv::ParamType< unsigned >::member_type']]], + ['map_163',['MAP',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a046708f7941fcfe57adab07734a605a0',1,'cv::FileNode']]], + ['map_164',['Map',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html',1,'cv::reg::Map'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'Eigen::Map< class, MapOptions, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Eigen::Map::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Eigen::Map::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Eigen::Map::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Derived, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Derived, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Derived, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Derived, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Derived, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Derived, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01const_01Quaternion_3_01__Scalar_01_4_00_01__Options_01_4.html#a62785b607c1f24dfc042e28dedc791f8',1,'Eigen::Map< const Quaternion< _Scalar >, _Options >::Map()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01Quaternion_3_01__Scalar_01_4_00_01__Options_01_4.html#a225f365e99258e028ef1ffa0031fab9b',1,'Eigen::Map< Quaternion< _Scalar >, _Options >::Map()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< SparseMatrix< _Scalar, _Flags, _StorageIndex > >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< SparseMatrix< _Scalar, _Flags, _StorageIndex > >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< SparseMatrix< _Scalar, _Flags, _StorageIndex > >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a43b3e84aba2ff1a241dbc3d177fb2e22',1,'Map< SparseMatrix< Scalar, _Flags, StorageIndex > >::Map(PointerArgType dataPtr, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a3f621386d55a373f53082ac62579897e',1,'Map< SparseMatrix< Scalar, _Flags, StorageIndex > >::Map(PointerArgType dataPtr, Index rows, Index cols, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html#a52069afac76e3f609a6865106dc10254',1,'Map< SparseMatrix< Scalar, _Flags, StorageIndex > >::Map(PointerArgType dataPtr, Index size, const StrideType &stride=StrideType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01SparseMatrixType_01_4.html#a3afd7ca5fb61494e9195a1e318078028',1,'Eigen::Map< SparseMatrixType >::Map(Index rows, Index cols, Index nnz, const StorageIndex *outerIndexPtr, const StorageIndex *innerIndexPtr, const Scalar *valuePtr, const StorageIndex *innerNonZerosPtr=0)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01SparseMatrixType_01_4.html#aeecd1e0e97eeae254ad97cdf5bde9ec2',1,'Eigen::Map< SparseMatrixType >::Map(Index rows, Index cols, Index nnz, StorageIndex *outerIndexPtr, StorageIndex *innerIndexPtr, Scalar *valuePtr, StorageIndex *innerNonZerosPtr=0)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'Eigen::PlainObjectBase::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'Eigen::PlainObjectBase::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'Eigen::PlainObjectBase::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'Eigen::PlainObjectBase::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'Eigen::PlainObjectBase::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'Eigen::PlainObjectBase::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'Eigen::PlainObjectBase::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'Eigen::PlainObjectBase::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'Eigen::PlainObjectBase::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'Eigen::PlainObjectBase::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'Eigen::PlainObjectBase::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'Eigen::PlainObjectBase::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf9fcc07dc13f89cf71d4a4e2b220d24',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab5392255cbc16c3d3d91b09088e027b4',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd3e2e293d1d8591a5e6772ecc4d2c4c',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab195765374a1d5dee35dff790346bd42',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#adffe779fdca149b5eba4dc542bf76b94',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad1815d868cb69ebba3d4e1c9e263d2af',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8ed320f4d926ab401117564cafc3e232',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a240ab54b8839d02bdd35e358a3d66b73',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aebf9df309b9b6f4e5cc0d495a423f749',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aaf22e2ddbebc397d1e6b17a95af8e7d4',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a1a3a8fd56500cda9a96189cd55472203',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad41d75bfc07b50b2912f99212a7265ed',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::Map(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)']]], + ['map_165',['map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08727.html',1,'std::__debug::map< _Key, _Tp, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08923.html',1,'std::__profile::map< _Key, _Tp, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html',1,'std::map< _Key, _Tp, _Compare, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00104.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html#a98faf5405ad3fb727f5205e4c2d7bf58',1,'cv::cudev::RemapPtr1::map'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#ad56f6160283a96780a3d02bc34595151',1,'cv::MatAllocator::map()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#afc7cdce90f8100d9bf741d33f2b50019',1,'std::map::map()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#aa12fa7df574ac42da454cba7581c258e',1,'std::map::map(const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a8710ed019be6e93c3e226853e91da124',1,'std::map::map(const map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a3f71fbbe2f15bf4a55f383030fe7d72f',1,'std::map::map(map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a353d38055f6c80e99c699ee4eeec914e',1,'std::map::map(initializer_list< value_type > __l, const _Compare &__comp=_Compare(), const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a97d93d27671323c77e27ef2986a4bcb8',1,'std::map::map(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ae74f7651afbcb8b1c2d491a7145f3313',1,'std::map::map(const map &__m, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a95c130beb22f45766110a5b734a5b7a6',1,'std::map::map(map &&__m, const allocator_type &__a) noexcept(is_nothrow_copy_constructible< _Compare >::value &&_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a8310f2293e381afba51e9cc44dd0eeef',1,'std::map::map(initializer_list< value_type > __l, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a0d2b5c52350b2b79506ab308b32ca5f1',1,'std::map::map(_InputIterator __first, _InputIterator __last, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a6339535802f1937f3dd78ee04d950ea7',1,'std::map::map(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ac30882bd54277810ace3d0630cbc3252',1,'std::map::map(_InputIterator __first, _InputIterator __last, const _Compare &__comp, const allocator_type &__a=allocator_type())']]], + ['map_20class_166',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], + ['map_20from_20stereo_20images_167',['Depth Map from Stereo Images',['https://docs.opencv.org/4.2.0/dd/d53/tutorial_py_depthmap.html',1,'']]], + ['map_20post_20filtering_168',['Disparity map post-filtering',['https://docs.opencv.org/4.2.0/d3/d14/tutorial_ximgproc_disparity_filtering.html',1,'']]], + ['map_2ehpp_169',['map.hpp',['https://docs.opencv.org/4.2.0/df/d7c/map_8hpp.html',1,'']]], + ['map_3c_20const_20array_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_170',['Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20array_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_171',['Map< const Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20array_3c_20double_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_172',['Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20array_3c_20double_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_173',['Map< const Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20array_3c_20index_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_174',['Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20array_3c_20index_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_175',['Map< const Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20array_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_176',['Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20array_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_177',['Map< const Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20array_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_178',['Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20array_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_179',['Map< const Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20array_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_180',['Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20array_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_181',['Map< const Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20derived_2c_20alignedmax_20_3e_182',['Map< const Derived, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20derived_2c_20unaligned_20_3e_183',['Map< const Derived, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20matrix_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_184',['Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20matrix_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_185',['Map< const Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20matrix_3c_20complexscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_186',['Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20matrix_3c_20complexscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_187',['Map< const Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20matrix_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_188',['Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20matrix_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_189',['Map< const Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20matrix_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_190',['Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20matrix_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_191',['Map< const Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20matrix_3c_20scalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_192',['Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20matrix_3c_20scalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_193',['Map< const Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20matrix_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20alignedmax_20_3e_194',['Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, AlignedMax >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20matrix_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_2c_20unaligned_20_3e_195',['Map< const Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols >, Unaligned >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20const_20quaternion_3c_20_5fscalar_20_3e_2c_20_5foptions_20_3e_196',['Map< const Quaternion< _Scalar >, _Options >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01const_01Quaternion_3_01__Scalar_01_4_00_01__Options_01_4.html',1,'Eigen']]], + ['map_3c_20int_2c_20string_20_3e_197',['map< int, String >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html',1,'std']]], + ['map_3c_20quaternion_3c_20_5fscalar_20_3e_2c_20_5foptions_20_3e_198',['Map< Quaternion< _Scalar >, _Options >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01Quaternion_3_01__Scalar_01_4_00_01__Options_01_4.html',1,'Eigen']]], + ['map_3c_20sparsematrix_3c_20_5fscalar_2c_20_5fflags_2c_20_5fstorageindex_20_3e_20_3e_199',['Map< SparseMatrix< _Scalar, _Flags, _StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20sparsematrix_3c_20scalar_2c_20_5fflags_2c_20storageindex_20_3e_20_3e_200',['Map< SparseMatrix< Scalar, _Flags, StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map.html',1,'']]], + ['map_3c_20sparsematrixtype_20_3e_201',['Map< SparseMatrixType >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01SparseMatrixType_01_4.html',1,'Eigen']]], + ['map_3c_20std_3a_3astring_2c_20msghandler_5ft_20_3e_202',['map< std::string, msghandler_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html',1,'std']]], + ['map_3c_20std_3a_3astring_2c_20protocoldata_20_3e_203',['map< std::string, ProtocolData >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html',1,'std']]], + ['map_3c_20std_3a_3astring_2c_20validator_5ft_20_3e_204',['map< std::string, validator_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html',1,'std']]], + ['map_3c_20string_2c_20std_3a_3avector_3c_20templatepyramid_20_3e_20_3e_205',['map< String, std::vector< TemplatePyramid > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html',1,'std']]], + ['mapaffine_206',['MapAffine',['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html',1,'cv::reg::MapAffine'],['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#acc52d4c3904bea5a600636512c1fd698',1,'cv::reg::MapAffine::MapAffine()'],['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#a523a626ee780193528933037bab58342',1,'cv::reg::MapAffine::MapAffine(InputArray linTr, InputArray shift)']]], + ['mapaffine_2ehpp_207',['mapaffine.hpp',['https://docs.opencv.org/4.2.0/dd/d7f/mapaffine_8hpp.html',1,'']]], + ['mapaligned_208',['MapAligned',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'Eigen::PlainObjectBase::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'Eigen::PlainObjectBase::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'Eigen::PlainObjectBase::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'Eigen::PlainObjectBase::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'Eigen::PlainObjectBase::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'Eigen::PlainObjectBase::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'Eigen::PlainObjectBase::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'Eigen::PlainObjectBase::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'Eigen::PlainObjectBase::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'Eigen::PlainObjectBase::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'Eigen::PlainObjectBase::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'Eigen::PlainObjectBase::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae618ce2543ce8deef2a838864de2b610',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aa3281e4121e5e404f93ee9890c13e1dd',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a7314ec5e42ff5f3563cf3f77090d8318',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a62d868608b47d93e3e0c86339870bc43',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8b161ab58c8370b97ac8131efb6964dc',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a98a4e03be918eb01bd7719d260debe1a',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aadc343ac6294b26d8e2033a1c1400600',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#abd8ce90b470cfa30cae08f9c673912c9',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a91374e2e77a219a44d980cc14be3a961',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a2b1ce06138d53af1bb729ec1dab87e5a',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index size, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a48fbb5cbf164540617c5ca3e05afe953',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(const Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af2ce47a0cde3943e528e00f2b191f7da',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::MapAligned(Scalar *data, Index rows, Index cols, const Stride< Outer, Inner > &stride)']]], + ['mapbackward_209',['mapBackward',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1detail_1_1CompressedRectilinearPortraitProjector.html#ac1326980813ddf21bae2576d8d6e2433',1,'cv::detail::CompressedRectilinearPortraitProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/db/dbb/structcv_1_1detail_1_1CompressedRectilinearProjector.html#a7f8cf7e90aa0d6719594e41e63c2b8f8',1,'cv::detail::CompressedRectilinearProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/df/d3f/structcv_1_1detail_1_1CylindricalPortraitProjector.html#ad2be06ada62e1113cb96327878d5a9a3',1,'cv::detail::CylindricalPortraitProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/dd/d96/structcv_1_1detail_1_1CylindricalProjector.html#afc8c891de72749c116eaae61ee5b0db3',1,'cv::detail::CylindricalProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d9/de9/structcv_1_1detail_1_1FisheyeProjector.html#a81b6f2d6e85590b0f06c51ca574184f3',1,'cv::detail::FisheyeProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d1/daa/structcv_1_1detail_1_1MercatorProjector.html#a2cd004542503dee227d1b0780972e6fe',1,'cv::detail::MercatorProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d3/dd1/structcv_1_1detail_1_1PaniniPortraitProjector.html#a0691319e5e53456a071fb5f00b2cd5f8',1,'cv::detail::PaniniPortraitProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d2/df1/structcv_1_1detail_1_1PaniniProjector.html#a022e808732ab79aa9e3d68e7a59125e4',1,'cv::detail::PaniniProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/df/d0d/structcv_1_1detail_1_1PlanePortraitProjector.html#aa84e0cde84ad602aff3caa7b0218b22a',1,'cv::detail::PlanePortraitProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d6/d1f/structcv_1_1detail_1_1PlaneProjector.html#ad6d194bbbee2fe09bf3c20682dee8754',1,'cv::detail::PlaneProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d3/d0d/structcv_1_1detail_1_1SphericalPortraitProjector.html#abecd1908bed4ca2f186cc85a3d581a19',1,'cv::detail::SphericalPortraitProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d0/d88/structcv_1_1detail_1_1SphericalProjector.html#a99e8bcc78ff64a99d9917e597ff3b688',1,'cv::detail::SphericalProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d0/ddf/structcv_1_1detail_1_1StereographicProjector.html#a9562e305667375c9155c22e7ead7c1cc',1,'cv::detail::StereographicProjector::mapBackward()'],['https://docs.opencv.org/4.2.0/d5/df7/structcv_1_1detail_1_1TransverseMercatorProjector.html#ab92befd6f93310e7490f0a57065a0e00',1,'cv::detail::TransverseMercatorProjector::mapBackward()']]], + ['mapbase_3c_20derived_2c_20readonlyaccessors_20_3e_210',['MapBase< Derived, ReadOnlyAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html',1,'Eigen']]], + ['mapbase_3c_20derived_2c_20writeaccessors_20_3e_211',['MapBase< Derived, WriteAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01WriteAccessors_01_4.html',1,'Eigen']]], + ['mapcount_212',['mapcount',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a962745e56207df9044692e6fa0617f57',1,'cv::UMatData']]], + ['mapdevice_213',['mapDevice',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a57864bec2d9dbef4edf25ea018db71d9',1,'cv::ogl::Buffer::mapDevice()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#abde1b6c518abefeee7cf878b066c65fb',1,'cv::ogl::Buffer::mapDevice(cuda::Stream &stream)']]], + ['mapforward_214',['mapForward',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1detail_1_1CompressedRectilinearPortraitProjector.html#aed4225e50d87676a9b73b1f46a277840',1,'cv::detail::CompressedRectilinearPortraitProjector::mapForward()'],['https://docs.opencv.org/4.2.0/db/dbb/structcv_1_1detail_1_1CompressedRectilinearProjector.html#aa84e919cc3041a43d790d163dee1c741',1,'cv::detail::CompressedRectilinearProjector::mapForward()'],['https://docs.opencv.org/4.2.0/df/d3f/structcv_1_1detail_1_1CylindricalPortraitProjector.html#a1a3a245fab74ae18a740074c1bdd57f8',1,'cv::detail::CylindricalPortraitProjector::mapForward()'],['https://docs.opencv.org/4.2.0/dd/d96/structcv_1_1detail_1_1CylindricalProjector.html#a76dac015854f097514c56afc13c95b7f',1,'cv::detail::CylindricalProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d9/de9/structcv_1_1detail_1_1FisheyeProjector.html#ae06aa70c6db995a2dc274b4275739db8',1,'cv::detail::FisheyeProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d1/daa/structcv_1_1detail_1_1MercatorProjector.html#ac6921255985a3f53445a8e1298f31740',1,'cv::detail::MercatorProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d3/dd1/structcv_1_1detail_1_1PaniniPortraitProjector.html#a3d0fc546b0f911b64b3c6b5613f82da1',1,'cv::detail::PaniniPortraitProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d2/df1/structcv_1_1detail_1_1PaniniProjector.html#a7781618e07c1541b9e291ce2e31b6b45',1,'cv::detail::PaniniProjector::mapForward()'],['https://docs.opencv.org/4.2.0/df/d0d/structcv_1_1detail_1_1PlanePortraitProjector.html#a7fdf2c51b4344000e0e2c40065df047a',1,'cv::detail::PlanePortraitProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d6/d1f/structcv_1_1detail_1_1PlaneProjector.html#a2d061a4c6b28430dbae9db5058b22e04',1,'cv::detail::PlaneProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d3/d0d/structcv_1_1detail_1_1SphericalPortraitProjector.html#ac095f1b9c9ad5fdcfdc00bc4a4192b98',1,'cv::detail::SphericalPortraitProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d0/d88/structcv_1_1detail_1_1SphericalProjector.html#ac272e6dfbc3c88372d7d65b03fcd512b',1,'cv::detail::SphericalProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d0/ddf/structcv_1_1detail_1_1StereographicProjector.html#a52f631c7449a1ae19640bad757942e0f',1,'cv::detail::StereographicProjector::mapForward()'],['https://docs.opencv.org/4.2.0/d5/df7/structcv_1_1detail_1_1TransverseMercatorProjector.html#a2f235d23845e2cd796d8369eda374de0',1,'cv::detail::TransverseMercatorProjector::mapForward()']]], + ['mapglbuffer_215',['mapGLBuffer',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga39ac62ef00a590b9021e233d1dcdc622',1,'cv::ogl::mapGLBuffer()'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga39ac62ef00a590b9021e233d1dcdc622',1,'mapGLBuffer()(Global Namespace)']]], + ['maphost_216',['mapHost',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a3e14b8b56c501c5c90c79aca9c744d18',1,'cv::ogl::Buffer']]], + ['mapped_5ftype_217',['mapped_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6d830d6d91653672a6f20b748327622b',1,'std::unordered_map::mapped_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6d830d6d91653672a6f20b748327622b',1,'std::unordered_map::mapped_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a3e1544ab885cd443cf557eb35db830e8',1,'std::unordered_multimap::mapped_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a3e1544ab885cd443cf557eb35db830e8',1,'std::unordered_multimap::mapped_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6d830d6d91653672a6f20b748327622b',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::mapped_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6d830d6d91653672a6f20b748327622b',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::mapped_type'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a1c9c1509ee714a9814b45a8030c84ec7.html#a1c9c1509ee714a9814b45a8030c84ec7',1,'nlohmann::ordered_map::mapped_type']]], + ['mappedsparsematrix_218',['MappedSparseMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1MappedSparseMatrix.html',1,'Eigen']]], + ['mappedsparsematrix_3c_20scalar_2c_20colmajor_2c_20storageindex_20_3e_219',['MappedSparseMatrix< Scalar, ColMajor, StorageIndex >',['https://eigen.tuxfamily.org/dox/classEigen_1_1MappedSparseMatrix.html',1,'']]], + ['mapper_220',['Mapper',['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1reg_1_1Mapper.html',1,'cv::reg']]], + ['mapper_2ehpp_221',['mapper.hpp',['https://docs.opencv.org/4.2.0/df/d13/mapper_8hpp.html',1,'']]], + ['mappergradaffine_222',['MapperGradAffine',['https://docs.opencv.org/4.2.0/d0/d89/classcv_1_1reg_1_1MapperGradAffine.html',1,'cv::reg::MapperGradAffine'],['https://docs.opencv.org/4.2.0/d0/d89/classcv_1_1reg_1_1MapperGradAffine.html#af843e3d2f712f83c2c6562e10e4f44e4',1,'cv::reg::MapperGradAffine::MapperGradAffine()']]], + ['mappergradaffine_2ehpp_223',['mappergradaffine.hpp',['https://docs.opencv.org/4.2.0/d7/d89/mappergradaffine_8hpp.html',1,'']]], + ['mappergradeuclid_224',['MapperGradEuclid',['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1reg_1_1MapperGradEuclid.html',1,'cv::reg::MapperGradEuclid'],['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1reg_1_1MapperGradEuclid.html#aff827d09109e7390de425128afbde638',1,'cv::reg::MapperGradEuclid::MapperGradEuclid()']]], + ['mappergradeuclid_2ehpp_225',['mappergradeuclid.hpp',['https://docs.opencv.org/4.2.0/d3/d4e/mappergradeuclid_8hpp.html',1,'']]], + ['mappergradproj_226',['MapperGradProj',['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1reg_1_1MapperGradProj.html',1,'cv::reg::MapperGradProj'],['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1reg_1_1MapperGradProj.html#adb7d59d8b9e27c063948d160dc378375',1,'cv::reg::MapperGradProj::MapperGradProj()']]], + ['mappergradproj_2ehpp_227',['mappergradproj.hpp',['https://docs.opencv.org/4.2.0/d2/d7f/mappergradproj_8hpp.html',1,'']]], + ['mappergradshift_228',['MapperGradShift',['https://docs.opencv.org/4.2.0/df/d24/classcv_1_1reg_1_1MapperGradShift.html',1,'cv::reg::MapperGradShift'],['https://docs.opencv.org/4.2.0/df/d24/classcv_1_1reg_1_1MapperGradShift.html#a4fcfe0d9e04ea7bcef35e8f73e763cc3',1,'cv::reg::MapperGradShift::MapperGradShift()']]], + ['mappergradshift_2ehpp_229',['mappergradshift.hpp',['https://docs.opencv.org/4.2.0/dc/d62/mappergradshift_8hpp.html',1,'']]], + ['mappergradsimilar_230',['MapperGradSimilar',['https://docs.opencv.org/4.2.0/de/d4c/classcv_1_1reg_1_1MapperGradSimilar.html',1,'cv::reg::MapperGradSimilar'],['https://docs.opencv.org/4.2.0/de/d4c/classcv_1_1reg_1_1MapperGradSimilar.html#a2e5aec1d89aeb13aa7142357002c73a7',1,'cv::reg::MapperGradSimilar::MapperGradSimilar()']]], + ['mappergradsimilar_2ehpp_231',['mappergradsimilar.hpp',['https://docs.opencv.org/4.2.0/d1/d14/mappergradsimilar_8hpp.html',1,'']]], + ['mapperpyramid_232',['MapperPyramid',['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html',1,'cv::reg::MapperPyramid'],['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html#ad248a390a4f7db2430f35803c6493394',1,'cv::reg::MapperPyramid::MapperPyramid()']]], + ['mapperpyramid_2ehpp_233',['mapperpyramid.hpp',['https://docs.opencv.org/4.2.0/de/da9/mapperpyramid_8hpp.html',1,'']]], + ['mapprojec_234',['MapProjec',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html',1,'cv::reg::MapProjec'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#a1a2300e403fb9d92ecbfbfc4437dfe85',1,'cv::reg::MapProjec::MapProjec()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#a89f46cb3a18dd8b293e8d2ed6b64caa3',1,'cv::reg::MapProjec::MapProjec(InputArray projTr)']]], + ['mapprojec_2ehpp_235',['mapprojec.hpp',['https://docs.opencv.org/4.2.0/df/d08/mapprojec_8hpp.html',1,'']]], + ['maps_236',['Unwrap two-dimensional phase maps',['https://docs.opencv.org/4.2.0/d9/dfb/tutorial_unwrap.html',1,'']]], + ['mapshift_237',['MapShift',['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html',1,'cv::reg::MapShift'],['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html#a0b359e0aaaca783ef38058e64c4e9813',1,'cv::reg::MapShift::MapShift()'],['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html#a8821c369932103aeb319edf5dd688bcd',1,'cv::reg::MapShift::MapShift(InputArray shift)']]], + ['mapshift_2ehpp_238',['mapshift.hpp',['https://docs.opencv.org/4.2.0/de/d67/mapshift_8hpp.html',1,'']]], + ['maptypecaster_239',['MapTypeCaster',['https://docs.opencv.org/4.2.0/da/d1b/classcv_1_1reg_1_1MapTypeCaster.html',1,'cv::reg']]], + ['mapx_240',['mapx',['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#ad1b4189a3370713447f3935337f8b0ec',1,'cv::cudev::RemapPtr2']]], + ['mapy_241',['mapy',['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#a12e4cdb3c6de74cbbd59bdb8fd4f4e2a',1,'cv::cudev::RemapPtr2']]], + ['marchcubes_242',['marchCubes',['https://docs.opencv.org/4.2.0/d1/d20/classcv_1_1dynafu_1_1DynaFu.html#addc26a60e4748d1a0fdc3239acd182c1',1,'cv::dynafu::DynaFu']]], + ['marching_20method_243',['Fast Marching Method',['https://docs.opencv.org/4.2.0/db/d18/group__videostab__marching.html',1,'']]], + ['margintype_244',['MarginType',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a9b5c495b5593ffda8a7055da07d0b751',1,'cv::ml::SVMSGD']]], + ['mark_5fcount_245',['mark_count',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a63d9a3b40af6aa139542ab152f18936c',1,'std::basic_regex']]], + ['markasseparated_246',['markAsSeparated',['https://docs.opencv.org/4.2.0/d1/dfd/structcv_1_1optflow_1_1GPCPatchDescriptor.html#a817b5ec10f659b463d084a586c369310',1,'cv::optflow::GPCPatchDescriptor']]], + ['markdevicecopyobsolete_247',['markDeviceCopyObsolete',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#aa7ed39306d6008f2f83654e67856a414',1,'cv::UMatData']]], + ['markdevicememmapped_248',['markDeviceMemMapped',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a2d5b899a98a2ead70375caa03cc37a29',1,'cv::UMatData']]], + ['marker_20detection_249',['ArUco Marker Detection',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html',1,'']]], + ['marker_20detection_20aruco_20module_250',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], + ['marker_5fcross_251',['MARKER_CROSS',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7baf28ad04b7620b2f232ab3c3faef142d5',1,'cv::MARKER_CROSS'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7baf28ad04b7620b2f232ab3c3faef142d5',1,'MARKER_CROSS(Global Namespace)']]], + ['marker_5fdiamond_252',['MARKER_DIAMOND',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba432cfe9d9aa8ff347afd5d11b6580a10',1,'cv::MARKER_DIAMOND'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba432cfe9d9aa8ff347afd5d11b6580a10',1,'MARKER_DIAMOND(Global Namespace)']]], + ['marker_5fsquare_253',['MARKER_SQUARE',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba17aaefd352d309fc4a17d06f64f7f56e',1,'cv::MARKER_SQUARE'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba17aaefd352d309fc4a17d06f64f7f56e',1,'MARKER_SQUARE(Global Namespace)']]], + ['marker_5fstar_254',['MARKER_STAR',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7bad5b611078a497ff7278b27e7a85b059b',1,'cv::MARKER_STAR'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7bad5b611078a497ff7278b27e7a85b059b',1,'MARKER_STAR(Global Namespace)']]], + ['marker_5ftilted_5fcross_255',['MARKER_TILTED_CROSS',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba433d7189d8fe53873c929b917c903752',1,'cv::MARKER_TILTED_CROSS'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba433d7189d8fe53873c929b917c903752',1,'MARKER_TILTED_CROSS(Global Namespace)']]], + ['marker_5ftriangle_5fdown_256',['MARKER_TRIANGLE_DOWN',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba8c45774007ca5883196614763b974577',1,'cv::MARKER_TRIANGLE_DOWN'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7ba8c45774007ca5883196614763b974577',1,'MARKER_TRIANGLE_DOWN(Global Namespace)']]], + ['marker_5ftriangle_5fup_257',['MARKER_TRIANGLE_UP',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7badc5b55da577d22ace3844809bc9a1049',1,'cv::MARKER_TRIANGLE_UP'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0ad87faebef1039ec957737ecc633b7badc5b55da577d22ace3844809bc9a1049',1,'MARKER_TRIANGLE_UP(Global Namespace)']]], + ['markerborderbits_258',['markerBorderBits',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#ae216e58b9ef6f52cdd72890ddfc060b0',1,'cv::aruco::DetectorParameters']]], + ['markerpattern_259',['MarkerPattern',['../classAR_1_1MarkerPattern.html',1,'AR::MarkerPattern'],['../classAR_1_1MarkerPattern.html#aff809f5b8e8c885380b480df80f7903a',1,'AR::MarkerPattern::MarkerPattern()'],['../classAR_1_1MarkerPattern.html#ab9b392db391fc1ad429105fccf8edf3c',1,'AR::MarkerPattern::MarkerPattern(uint8_t data_region_size, uint8_t border_size, cv::Mat bits, int id)']]], + ['markers_260',['Markers',['https://docs.opencv.org/4.2.0/d5/dae/tutorial_aruco_detection.html',1,'Detection of ArUco Markers'],['https://docs.opencv.org/4.2.0/d5/d07/tutorial_charuco_diamond_detection.html',1,'Detection of Diamond Markers']]], + ['markerset_261',['MarkerSet',['../classAR_1_1MarkerSet.html',1,'AR::MarkerSet'],['../classAR_1_1MarkerSet.html#aa4fde560f82e5b8e822855e6d5934f65',1,'AR::MarkerSet::MarkerSet(uint8_t data_region_size, uint8_t border_size, float physical_size, cv::aruco::Dictionary markerDict)'],['../classAR_1_1MarkerSet.html#a542868baffb1253cb137182d0f389ebe',1,'AR::MarkerSet::MarkerSet(uint8_t data_region_size, uint8_t border_size, float physical_size, cv::Ptr< cv::aruco::Dictionary > markerDictPtr)']]], + ['markersize_262',['markerSize',['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a996eb5d27e061fedf0550092a6149ed7',1,'cv::aruco::Dictionary']]], + ['markerslocation_263',['markersLocation',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#a3ffbabeee2c5ed33fbb2464d842a2cf7',1,'cv::structured_light::SinusoidalPattern::Params']]], + ['markertypes_264',['MarkerTypes',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga0ad87faebef1039ec957737ecc633b7b',1,'cv::MarkerTypes'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga0ad87faebef1039ec957737ecc633b7b',1,'MarkerTypes(Global Namespace)']]], + ['markhostcopyobsolete_265',['markHostCopyObsolete',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a613d3a32b2b6543662d2a9809ce05217',1,'cv::UMatData']]], + ['maroon_266',['maroon',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1b30c08d9f269bfbdb877ce7f582ddd5',1,'cv::viz::Color']]], + ['marr_5fhildreth_5fhash_2ehpp_267',['marr_hildreth_hash.hpp',['https://docs.opencv.org/4.2.0/d3/d20/marr__hildreth__hash_8hpp.html',1,'']]], + ['marrhildrethhash_268',['MarrHildrethHash',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1img__hash_1_1MarrHildrethHash.html',1,'cv::img_hash::MarrHildrethHash'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1img__hash_1_1MarrHildrethHash.html#aec90e4ce0b3b2c2045f8eae8e4cc65f8',1,'cv::img_hash::MarrHildrethHash::MarrHildrethHash()']]], + ['marrhildrethhash_269',['marrHildrethHash',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gaf849522d808a8ef9ae2ed9422cf236b7',1,'cv::img_hash::marrHildrethHash()'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gaf849522d808a8ef9ae2ed9422cf236b7',1,'marrHildrethHash()(Global Namespace)']]], + ['mask_270',['mask',['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#a98eb6356c2c4c84a1dd8ab751aef206a',1,'cv::rgbd::RgbdFrame::mask'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#affc58592272d7281fa4e868c7d7831c4',1,'cv::cudev::SingleMaskChannels::mask'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaba076d51941328cb7ca9348b7b535220',1,'cv::gapi::mask()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaba076d51941328cb7ca9348b7b535220',1,'mask(const GMat &src, const GMat &mask)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145af2ce11ebf110993621bedd8e747d7b1b',1,'mask(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145af2ce11ebf110993621bedd8e747d7b1b',1,'mask(Global Namespace)']]], + ['mask_20operations_20on_20matrices_271',['Mask operations on matrices',['https://docs.opencv.org/4.2.0/d7/d37/tutorial_mat_mask_operations.html',1,'']]], + ['mask_2ehpp_272',['mask.hpp',['https://docs.opencv.org/4.2.0/d3/dbb/mask_8hpp.html',1,'']]], + ['mask1_273',['mask1',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a17dea5e87ecb4cd70334382de54ebc01',1,'cv::cuda::SURF_CUDA']]], + ['mask_5farray_274',['mask_array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04659.html',1,'std::mask_array< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga63910750064214d819524e634cdaebfa',1,'std::mask_array::mask_array()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga63910750064214d819524e634cdaebfa',1,'mask_array(const mask_array &)(Global Namespace)']]], + ['mask_5farray_2eh_275',['mask_array.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00419.html',1,'']]], + ['mask_5fbased_5frange_5fhashing_276',['mask_based_range_hashing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11735.html',1,'__gnu_pbds::detail']]], + ['mask_5fbased_5frange_5fhashing_2ehpp_277',['mask_based_range_hashing.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01319.html',1,'']]], + ['maskframesource_278',['MaskFrameSource',['https://docs.opencv.org/4.2.0/da/d26/classcv_1_1videostab_1_1MaskFrameSource.html',1,'cv::videostab::MaskFrameSource'],['https://docs.opencv.org/4.2.0/da/d26/classcv_1_1videostab_1_1MaskFrameSource.html#a8b94dbd043a3bc436839c15ba0c8e943',1,'cv::videostab::MaskFrameSource::MaskFrameSource()']]], + ['maskgenerator_279',['MaskGenerator',['https://docs.opencv.org/4.2.0/d6/dfb/classcv_1_1BaseCascadeClassifier_1_1MaskGenerator.html',1,'cv::BaseCascadeClassifier']]], + ['maskistiled_280',['MaskIsTiled',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa9a2b6e0d80053fdd4909ef6cf80326d8',1,'cv::Error']]], + ['masks_5f_281',['masks_',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a3db4bcfb73c963e7eeb92ecffdda5db6',1,'cv::detail::PairwiseSeamFinder']]], + ['masksource_282',['maskSource',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#af1488f09ab147bd9d06b775189d255b7',1,'cv::videostab::StabilizerBase']]], + ['masksource_5f_283',['maskSource_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a7d8e382c7286c16bc44ed07160ecf6c0',1,'cv::videostab::StabilizerBase']]], + ['masksum_284',['maskSum',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a45223b25f9b1dbf54b2afb84db4970e1',1,'cv::cuda::SURF_CUDA']]], + ['master_20installation_20by_20using_20git_20bash_20version_202_2014_201_20and_20cmake_20version_203_209_201_285',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['mat_286',['MAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba78b5339efc1a4718ab6a1b688ccffc1c',1,'cv::_InputArray::MAT'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aaf0c2c0ca864067cc6e21a7ea2c1b1fdd',1,'MAT(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aaf0c2c0ca864067cc6e21a7ea2c1b1fdd',1,'MAT(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aaf0c2c0ca864067cc6e21a7ea2c1b1fdd',1,'MAT(Global Namespace)']]], + ['mat_287',['Mat',['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html',1,'cv::gapi::own::Mat'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html',1,'cv::Mat'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af1d014cecd1510cdf580bf2ed7e5aafc',1,'cv::Mat::Mat()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a2ec3402f7d165ca34c7fd6e8498a62ca',1,'cv::Mat::Mat(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a75a97b1e4e55f380c172af58048a7cde',1,'cv::Mat::Mat(Size size, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a3620c370690b5ca4d40c767be6fb4ceb',1,'cv::Mat::Mat(int rows, int cols, int type, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a286371a6196eaaaf0b86e158590460b7',1,'cv::Mat::Mat(Size size, int type, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a156df5a1326dd5c30b187b0e721a5f57',1,'cv::Mat::Mat(int ndims, const int *sizes, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a6adc4d64db5379bcbb713e71c9292f6e',1,'cv::Mat::Mat(const std::vector< int > &sizes, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#afbf34be80b7443123b2a032a67c3c4e3',1,'cv::Mat::Mat(int ndims, const int *sizes, int type, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ad20a78b5501fc39543a240142a40e234',1,'cv::Mat::Mat(const std::vector< int > &sizes, int type, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a294eaf8a95d2f9c7be19ff594d06278e',1,'cv::Mat::Mat(const Mat &m)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a51615ebf17a64c968df0bf49b4de6a3a',1,'cv::Mat::Mat(int rows, int cols, int type, void *data, size_t step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a9fa74fb14362d87cb183453d2441948f',1,'cv::Mat::Mat(Size size, int type, void *data, size_t step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a5fafc033e089143062fd31015b5d0f40',1,'cv::Mat::Mat(int ndims, const int *sizes, int type, void *data, const size_t *steps=0)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a922de793eabcec705b3579c5f95a643e',1,'cv::Mat::Mat(const std::vector< int > &sizes, int type, void *data, const size_t *steps=0)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a92a3e9e5911a2eb0cf0950a0a9670c76',1,'cv::Mat::Mat(const Mat &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa7ec97373406215f2d4bc72cc1d27036',1,'cv::Mat::Mat(const Mat &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#afde22a742fc73c0a150a9002310ac2eb',1,'cv::Mat::Mat(const Mat &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa6e903a6c762478692791a33d233019b',1,'cv::Mat::Mat(const Mat &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a23b182c4ffd46abe38f460c1480ae887',1,'cv::Mat::Mat(const std::vector< _Tp > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#afccd5d581d7dc205925debf83ea4c7be',1,'cv::Mat::Mat(const std::initializer_list< _Tp > list)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a174d591e68a4876f7164aefb1f3551d5',1,'cv::Mat::Mat(const std::initializer_list< int > sizes, const std::initializer_list< _Tp > list)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af831f6ce5e9ff546682e8155b5c835b1',1,'cv::Mat::Mat(const std::array< _Tp, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a507e01fb48b34a3e5c45f9f5b00725e8',1,'cv::Mat::Mat(const Vec< _Tp, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a37068a8d9acc7cc5af817eb82b2aa83b',1,'cv::Mat::Mat(const Matx< _Tp, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a224477889ddc7424aaab1b76e7682ea2',1,'cv::Mat::Mat(const Point_< _Tp > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a7d72610ed5aed9117eb7933a97670309',1,'cv::Mat::Mat(const Point3_< _Tp > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a23957ae2fed348c67952c0d69c873972',1,'cv::Mat::Mat(const MatCommaInitializer_< _Tp > &commaInitializer)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa82eca82664985c81c7912b04549370d',1,'cv::Mat::Mat(const cuda::GpuMat &m)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#adcaeb226bafeff8a1b262f57f6ffbcc4',1,'cv::Mat::Mat(Mat &&m)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a16a2cd2d814cbd55c45a48c7a0baf1c0',1,'cv::gapi::own::Mat::Mat()=default'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#ae1d3f6c4e8f742d83a2db8a399d39f1c',1,'cv::gapi::own::Mat::Mat(int _rows, int _cols, int _type, void *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#aa6165a0c8d914383bca8d9cc514d817c',1,'cv::gapi::own::Mat::Mat(const std::vector< int > &_dims, int _type, void *_data)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a70c8088d155be7349395707b82af3201',1,'cv::gapi::own::Mat::Mat(std::vector< int > &&_dims, int _type, void *_data)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#ac23d30e1c30faab9b75ed2017bfc6a78',1,'cv::gapi::own::Mat::Mat(Mat const &src, const Rect &roi)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a1a1fc825c35cd15ab6ed58577b656611',1,'cv::gapi::own::Mat::Mat(Mat const &src)=default'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a5dcf42d437b66adb458a0d7bccff564a',1,'cv::gapi::own::Mat::Mat(Mat &&src)=default']]], + ['mat_288',['mat',['https://docs.opencv.org/4.2.0/d9/dff/structcv_1_1datasets_1_1IR__affineObj.html#a64e3005ee9661a9a8b67bc8a35afc902',1,'cv::datasets::IR_affineObj::mat'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a42a7627680e1866327c479e0e38cc889',1,'cv::FileNode::mat()']]], + ['mat_20data_289',['Plot function for Mat data',['https://docs.opencv.org/4.2.0/db/dfe/group__plot.html',1,'']]], + ['mat_20the_20basic_20image_20container_290',['Mat - The Basic Image Container',['https://docs.opencv.org/4.2.0/d6/d6d/tutorial_mat_the_basic_image_container.html',1,'']]], + ['mat_2ehpp_291',['mat.hpp',['https://docs.opencv.org/4.2.0/d3/d82/core_2include_2opencv2_2core_2mat_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d69/gapi_2include_2opencv2_2gapi_2own_2mat_8hpp.html',1,'(Global Namespace)']]], + ['mat1_292',['mat1',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html#ae5c8c96e9d4f371b590ea554d96405d1',1,'cv::datasets::cameraParam']]], + ['mat1b_293',['Mat1b',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1d355af1bc5c7241588bdb3600951515',1,'cv::Mat1b'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1d355af1bc5c7241588bdb3600951515',1,'Mat1b(Global Namespace)']]], + ['mat1d_294',['Mat1d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8dc8a9e248a8885bb3c61d35f07b61ed',1,'cv::Mat1d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8dc8a9e248a8885bb3c61d35f07b61ed',1,'Mat1d(Global Namespace)']]], + ['mat1f_295',['Mat1f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga9747ac59f97cbb93ddd719c4fb3e2d5d',1,'cv::Mat1f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga9747ac59f97cbb93ddd719c4fb3e2d5d',1,'Mat1f(Global Namespace)']]], + ['mat1i_296',['Mat1i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga87332e283de569e7bb029d4f4b401dcc',1,'cv::Mat1i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga87332e283de569e7bb029d4f4b401dcc',1,'Mat1i(Global Namespace)']]], + ['mat1s_297',['Mat1s',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0c456856506ff905ce035acec092ef9f',1,'cv::Mat1s'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0c456856506ff905ce035acec092ef9f',1,'Mat1s(Global Namespace)']]], + ['mat1w_298',['Mat1w',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga4895c2ba170884f13b4a1b1c80fea8ff',1,'cv::Mat1w'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga4895c2ba170884f13b4a1b1c80fea8ff',1,'Mat1w(Global Namespace)']]], + ['mat2_299',['mat2',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html#a79533c441eb4c06bff212f8652f1f5a7',1,'cv::datasets::cameraParam']]], + ['mat2b_300',['Mat2b',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf7e98a9c920ba16ba08b99bb53c52224',1,'cv::Mat2b'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf7e98a9c920ba16ba08b99bb53c52224',1,'Mat2b(Global Namespace)']]], + ['mat2d_301',['Mat2d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga04278ad1d5a287e15c07239d6119fe0a',1,'cv::Mat2d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga04278ad1d5a287e15c07239d6119fe0a',1,'Mat2d(Global Namespace)']]], + ['mat2f_302',['Mat2f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5d6e8769d5f6a8b21eb59137e643f095',1,'cv::Mat2f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5d6e8769d5f6a8b21eb59137e643f095',1,'Mat2f(Global Namespace)']]], + ['mat2i_303',['Mat2i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1ee6db17208ebd8bef5749d81267bf17',1,'cv::Mat2i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1ee6db17208ebd8bef5749d81267bf17',1,'Mat2i(Global Namespace)']]], + ['mat2s_304',['Mat2s',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf945be4c317df201188e50e578e1fa75',1,'cv::Mat2s'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf945be4c317df201188e50e578e1fa75',1,'Mat2s(Global Namespace)']]], + ['mat2w_305',['Mat2w',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaeb96ec2e3fd29bc27da746681e692b60',1,'cv::Mat2w'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaeb96ec2e3fd29bc27da746681e692b60',1,'Mat2w(Global Namespace)']]], + ['mat3_306',['Mat3',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a37ca518be694a545a9572a3e5546e9e8',1,'cv::Affine3::Mat3'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a37ca518be694a545a9572a3e5546e9e8',1,'Affine3< float >::Mat3']]], + ['mat3_307',['mat3',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html#a806a1c2e37b570d2212307a16be4e2cf',1,'cv::datasets::cameraParam']]], + ['mat3b_308',['Mat3b',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7198dbdcacbcde70f7c7d1209d57146a',1,'cv::Mat3b'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7198dbdcacbcde70f7c7d1209d57146a',1,'Mat3b(Global Namespace)']]], + ['mat3d_309',['Mat3d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf14b1aa52fc952072c0b653f916ffac8',1,'cv::Mat3d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf14b1aa52fc952072c0b653f916ffac8',1,'Mat3d(Global Namespace)']]], + ['mat3f_310',['Mat3f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8ee031423ba0ecb65fef2bc40abd970e',1,'cv::Mat3f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8ee031423ba0ecb65fef2bc40abd970e',1,'Mat3f(Global Namespace)']]], + ['mat3i_311',['Mat3i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga89d566f26821c717c666d31bcfc6bf35',1,'cv::Mat3i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga89d566f26821c717c666d31bcfc6bf35',1,'Mat3i(Global Namespace)']]], + ['mat3s_312',['Mat3s',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga4c3cec2bb940613dec561e59b0948801',1,'cv::Mat3s'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga4c3cec2bb940613dec561e59b0948801',1,'Mat3s(Global Namespace)']]], + ['mat3w_313',['Mat3w',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5574e954e5acfdb4e1e03e1dbd8bab6a',1,'cv::Mat3w'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5574e954e5acfdb4e1e03e1dbd8bab6a',1,'Mat3w(Global Namespace)']]], + ['mat4_314',['Mat4',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a9466d60cebb8d94b8bf23e52aa89b95b',1,'cv::Affine3::Mat4'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a9466d60cebb8d94b8bf23e52aa89b95b',1,'Affine3< float >::Mat4']]], + ['mat4_315',['mat4',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html#a8cffc15426d4fa26e2e944e0a4a27e98',1,'cv::datasets::cameraParam']]], + ['mat4b_316',['Mat4b',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga38bd307d9a0cac4c335e648ef8b63a3e',1,'cv::Mat4b'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga38bd307d9a0cac4c335e648ef8b63a3e',1,'Mat4b(Global Namespace)']]], + ['mat4d_317',['Mat4d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gab7781ee46e4a6148e037be23217201dc',1,'cv::Mat4d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gab7781ee46e4a6148e037be23217201dc',1,'Mat4d(Global Namespace)']]], + ['mat4f_318',['Mat4f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga781cc98063ecb8e02e3576140714842f',1,'cv::Mat4f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga781cc98063ecb8e02e3576140714842f',1,'Mat4f(Global Namespace)']]], + ['mat4i_319',['Mat4i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8895fd82b424209f63bf9713fd5259a2',1,'cv::Mat4i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8895fd82b424209f63bf9713fd5259a2',1,'Mat4i(Global Namespace)']]], + ['mat4s_320',['Mat4s',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7de7f3b26b41d7326e85ab2e5d9eb1c4',1,'cv::Mat4s'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7de7f3b26b41d7326e85ab2e5d9eb1c4',1,'Mat4s(Global Namespace)']]], + ['mat4w_321',['Mat4w',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga66c490bf66285c5cb0b5a21696d0cd03',1,'cv::Mat4w'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga66c490bf66285c5cb0b5a21696d0cd03',1,'Mat4w(Global Namespace)']]], + ['mat_5f_322',['Mat_',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'cv::Mat_< _Tp >'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'cv::Mat_::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'cv::Mat_::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'cv::Mat_::Mat_(int _rows, int _cols, const _Tp &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'cv::Mat_::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'cv::Mat_::Mat_(Size _size, const _Tp &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'cv::Mat_::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'cv::Mat_::Mat_(int _ndims, const int *_sizes, const _Tp &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'cv::Mat_::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'cv::Mat_::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'cv::Mat_::Mat_(int _rows, int _cols, _Tp *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'cv::Mat_::Mat_(int _ndims, const int *_sizes, _Tp *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'cv::Mat_::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'cv::Mat_::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'cv::Mat_::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'cv::Mat_::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'cv::Mat_::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'cv::Mat_::Mat_(const std::vector< _Tp > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'cv::Mat_::Mat_(const Vec< typename DataType< _Tp >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'cv::Mat_::Mat_(const Matx< typename DataType< _Tp >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'cv::Mat_::Mat_(const Point_< typename DataType< _Tp >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'cv::Mat_::Mat_(const Point3_< typename DataType< _Tp >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'cv::Mat_::Mat_(const MatCommaInitializer_< _Tp > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'cv::Mat_::Mat_(std::initializer_list< _Tp > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'cv::Mat_::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< _Tp > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'cv::Mat_::Mat_(const std::array< _Tp, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'cv::Mat_::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'cv::Mat_::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'cv::Mat_::Mat_(MatExpr &&e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'Mat_< double >::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'Mat_< double >::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'Mat_< double >::Mat_(int _rows, int _cols, const double &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'Mat_< double >::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'Mat_< double >::Mat_(Size _size, const double &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'Mat_< double >::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'Mat_< double >::Mat_(int _ndims, const int *_sizes, const double &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'Mat_< double >::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'Mat_< double >::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'Mat_< double >::Mat_(int _rows, int _cols, double *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'Mat_< double >::Mat_(int _ndims, const int *_sizes, double *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'Mat_< double >::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'Mat_< double >::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'Mat_< double >::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'Mat_< double >::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'Mat_< double >::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'Mat_< double >::Mat_(const std::vector< double > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'Mat_< double >::Mat_(const Vec< typename DataType< double >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'Mat_< double >::Mat_(const Matx< typename DataType< double >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'Mat_< double >::Mat_(const Point_< typename DataType< double >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'Mat_< double >::Mat_(const Point3_< typename DataType< double >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'Mat_< double >::Mat_(const MatCommaInitializer_< double > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'Mat_< double >::Mat_(std::initializer_list< double > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'Mat_< double >::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< double > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'Mat_< double >::Mat_(const std::array< double, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'Mat_< double >::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'Mat_< double >::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'Mat_< double >::Mat_(MatExpr &&e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'Mat_< float >::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'Mat_< float >::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'Mat_< float >::Mat_(int _rows, int _cols, const float &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'Mat_< float >::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'Mat_< float >::Mat_(Size _size, const float &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'Mat_< float >::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'Mat_< float >::Mat_(int _ndims, const int *_sizes, const float &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'Mat_< float >::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'Mat_< float >::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'Mat_< float >::Mat_(int _rows, int _cols, float *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'Mat_< float >::Mat_(int _ndims, const int *_sizes, float *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'Mat_< float >::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'Mat_< float >::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'Mat_< float >::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'Mat_< float >::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'Mat_< float >::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'Mat_< float >::Mat_(const std::vector< float > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'Mat_< float >::Mat_(const Vec< typename DataType< float >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'Mat_< float >::Mat_(const Matx< typename DataType< float >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'Mat_< float >::Mat_(const Point_< typename DataType< float >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'Mat_< float >::Mat_(const Point3_< typename DataType< float >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'Mat_< float >::Mat_(const MatCommaInitializer_< float > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'Mat_< float >::Mat_(std::initializer_list< float > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'Mat_< float >::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< float > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'Mat_< float >::Mat_(const std::array< float, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'Mat_< float >::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'Mat_< float >::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'Mat_< float >::Mat_(MatExpr &&e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'Mat_< uchar >::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'Mat_< uchar >::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'Mat_< uchar >::Mat_(int _rows, int _cols, const uchar &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'Mat_< uchar >::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'Mat_< uchar >::Mat_(Size _size, const uchar &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'Mat_< uchar >::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'Mat_< uchar >::Mat_(int _ndims, const int *_sizes, const uchar &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'Mat_< uchar >::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'Mat_< uchar >::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'Mat_< uchar >::Mat_(int _rows, int _cols, uchar *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'Mat_< uchar >::Mat_(int _ndims, const int *_sizes, uchar *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'Mat_< uchar >::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'Mat_< uchar >::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'Mat_< uchar >::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'Mat_< uchar >::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'Mat_< uchar >::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'Mat_< uchar >::Mat_(const std::vector< uchar > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'Mat_< uchar >::Mat_(const Vec< typename DataType< uchar >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'Mat_< uchar >::Mat_(const Matx< typename DataType< uchar >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'Mat_< uchar >::Mat_(const Point_< typename DataType< uchar >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'Mat_< uchar >::Mat_(const Point3_< typename DataType< uchar >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'Mat_< uchar >::Mat_(const MatCommaInitializer_< uchar > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'Mat_< uchar >::Mat_(std::initializer_list< uchar > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'Mat_< uchar >::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< uchar > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'Mat_< uchar >::Mat_(const std::array< uchar, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'Mat_< uchar >::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'Mat_< uchar >::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'Mat_< uchar >::Mat_(MatExpr &&e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'Mat_< unsigned char >::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'Mat_< unsigned char >::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'Mat_< unsigned char >::Mat_(int _rows, int _cols, const unsigned char &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'Mat_< unsigned char >::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'Mat_< unsigned char >::Mat_(Size _size, const unsigned char &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'Mat_< unsigned char >::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'Mat_< unsigned char >::Mat_(int _ndims, const int *_sizes, const unsigned char &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'Mat_< unsigned char >::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'Mat_< unsigned char >::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'Mat_< unsigned char >::Mat_(int _rows, int _cols, unsigned char *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'Mat_< unsigned char >::Mat_(int _ndims, const int *_sizes, unsigned char *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'Mat_< unsigned char >::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'Mat_< unsigned char >::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'Mat_< unsigned char >::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'Mat_< unsigned char >::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'Mat_< unsigned char >::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'Mat_< unsigned char >::Mat_(const std::vector< unsigned char > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'Mat_< unsigned char >::Mat_(const Vec< typename DataType< unsigned char >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'Mat_< unsigned char >::Mat_(const Matx< typename DataType< unsigned char >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'Mat_< unsigned char >::Mat_(const Point_< typename DataType< unsigned char >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'Mat_< unsigned char >::Mat_(const Point3_< typename DataType< unsigned char >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'Mat_< unsigned char >::Mat_(const MatCommaInitializer_< unsigned char > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'Mat_< unsigned char >::Mat_(std::initializer_list< unsigned char > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'Mat_< unsigned char >::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< unsigned char > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'Mat_< unsigned char >::Mat_(const std::array< unsigned char, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'Mat_< unsigned char >::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'Mat_< unsigned char >::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'Mat_< unsigned char >::Mat_(MatExpr &&e)']]], + ['mat_5f_3c_20double_20_3e_323',['Mat_< double >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'cv::Mat_< double >'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'Mat_< double >']]], + ['mat_5f_3c_20float_20_3e_324',['Mat_< float >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], + ['mat_5f_3c_20int_20_3e_325',['Mat_< int >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'cv::Mat_< int >'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'Mat_< int >']]], + ['mat_5f_3c_20uchar_20_3e_326',['Mat_< uchar >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], + ['mat_5f_3c_20unsigned_20char_20_3e_327',['Mat_< unsigned char >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], + ['mat_5fmask_5foperations_2emarkdown_328',['mat_mask_operations.markdown',['https://docs.opencv.org/4.2.0/d6/d41/mat__mask__operations_8markdown.html',1,'']]], + ['mat_5foperations_2emarkdown_329',['mat_operations.markdown',['https://docs.opencv.org/4.2.0/d8/d36/mat__operations_8markdown.html',1,'']]], + ['mat_5fthe_5fbasic_5fimage_5fcontainer_2emarkdown_330',['mat_the_basic_image_container.markdown',['https://docs.opencv.org/4.2.0/dc/d90/mat__the__basic__image__container_8markdown.html',1,'']]], + ['mat_5ftype_331',['mat_type',['https://docs.opencv.org/4.2.0/d2/d60/structcv_1_1quality_1_1QualityGMSD_1_1__mat__data.html#adfba652a0b78ac3362f46a87ed34a987',1,'cv::quality::QualityGMSD::_mat_data::mat_type'],['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#af77780870032e20cfdc3909bd8a3a96d',1,'cv::quality::QualitySSIM::_mat_data::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'cv::Matx::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< _Tp, cn, 1 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, 1, 3 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, 2, 2 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, 2, 3 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, 3, 3 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, 3, 4 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, 4, 4 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< double, cn, 1 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< float, 2, 3 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< float, 3, 3 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< float, cn, 1 >::mat_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aaa55844d27a10c24f9879df52d30ef93',1,'Matx< float_type, 4, 4 >::mat_type']]], + ['mat_5fvector_332',['MAT_VECTOR',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aac4f6db46662589f21d34d4abafdf8fb7',1,'MAT_VECTOR(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aac4f6db46662589f21d34d4abafdf8fb7',1,'MAT_VECTOR(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aac4f6db46662589f21d34d4abafdf8fb7',1,'MAT_VECTOR(Global Namespace)']]], + ['matallocator_333',['MatAllocator',['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html',1,'cv::MatAllocator'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#a279cc239b836c7f06e60de9d00f8f73f',1,'cv::MatAllocator::MatAllocator()']]], + ['match_334',['Match',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html',1,'cv::linemod::Match'],['https://docs.opencv.org/4.2.0/df/dee/structcv_1_1stereo_1_1Match.html',1,'cv::stereo::Match'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#aa8283f8751fb7887d18eb024ef200adb',1,'cv::linemod::Match::Match()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0ee629062c3c2745dba41a3e3605ff49',1,'cv::linemod::Match::Match(int x, int y, float similarity, const String &class_id, int template_id)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0ee629062c3c2745dba41a3e3605ff49',1,'Match()(Global Namespace)']]], + ['match_335',['match',['https://docs.opencv.org/4.2.0/d3/dda/classcv_1_1detail_1_1AffineBestOf2NearestMatcher.html#a565d4c8159841f78b6a27e479c45f2f9',1,'cv::detail::AffineBestOf2NearestMatcher::match()'],['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#ad50ac0d2cbc1d4ee3c52ec7a81d63408',1,'cv::detail::BestOf2NearestMatcher::match()'],['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html#a72ab280d507ccb95240300ecd0b00fc0',1,'cv::line_descriptor::BinaryDescriptorMatcher::match(const Mat &queryDescriptors, const Mat &trainDescriptors, std::vector< DMatch > &matches, const Mat &mask=Mat()) const'],['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html#a0f353796fee66fe7e2692a5cce29861d',1,'cv::line_descriptor::BinaryDescriptorMatcher::match(const Mat &queryDescriptors, std::vector< DMatch > &matches, const std::vector< Mat > &masks=std::vector< Mat >())'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a0f046f47b68ec7074391e1e85c750cba',1,'cv::DescriptorMatcher::match(InputArray queryDescriptors, InputArray trainDescriptors, std::vector< DMatch > &matches, InputArray mask=noArray()) const'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a695c0aceafc907c024c24a0b5cdff758',1,'cv::DescriptorMatcher::match(InputArray queryDescriptors, std::vector< DMatch > &matches, InputArrayOfArrays masks=noArray())'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a062cb997b9031a7acbe77f4f60682304',1,'cv::cuda::DescriptorMatcher::match(InputArray queryDescriptors, InputArray trainDescriptors, std::vector< DMatch > &matches, InputArray mask=noArray())=0'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a71f79d53a5d321077b43bf25603a306e',1,'cv::cuda::DescriptorMatcher::match(InputArray queryDescriptors, std::vector< DMatch > &matches, const std::vector< GpuMat > &masks=std::vector< GpuMat >())=0'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a57ec7d6920aa3d31f91ac6972cb12ee5',1,'cv::linemod::Detector::match()'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a22005bcc8bf637398b2a325121b44bb1',1,'cv::detail::FeaturesMatcher::match()'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a13757c035f9c95841f7f14f6170c8ffc',1,'cv::ppf_match_3d::PPF3DDetector::match()'],['https://docs.opencv.org/4.2.0/d2/d58/classcv_1_1cuda_1_1TemplateMatching.html#a05a565a53461c916b3b10737cbe43a01',1,'cv::cuda::TemplateMatching::match()']]], + ['match_5fany_336',['match_any',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#af78cac45372ace2e9fdd8bcf7eb27399',1,'std::regex_constants']]], + ['match_5fcontinuous_337',['match_continuous',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a372e043458fd815d130056e1225a00a5',1,'std::regex_constants']]], + ['match_5fdefault_338',['match_default',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ac070d8adb9f48dcfad7f69f4f2373708',1,'std::regex_constants']]], + ['match_5fflag_5ftype_339',['match_flag_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#aaa717c7c94d1075dfb06f79feb4ca11c',1,'std::regex_constants']]], + ['match_5fnot_5fbol_340',['match_not_bol',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#af0a051640e6d5b7be783ecef1bd6057c',1,'std::regex_constants']]], + ['match_5fnot_5fbow_341',['match_not_bow',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ae61a11ae1d6998a161bdbb50c63dd0e2',1,'std::regex_constants']]], + ['match_5fnot_5feol_342',['match_not_eol',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a2fa4bcec54ff420f477a7bbfe6f9925b',1,'std::regex_constants']]], + ['match_5fnot_5feow_343',['match_not_eow',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a7e422c4098322e3bf17eafd35fc16c7e',1,'std::regex_constants']]], + ['match_5fnot_5fnull_344',['match_not_null',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#aa135ecb11f0299ff447a7133a91d73e3',1,'std::regex_constants']]], + ['match_5fprev_5favail_345',['match_prev_avail',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ad48b9cdb07f0c311ec5ffeb093c209d5',1,'std::regex_constants']]], + ['match_5fresults_346',['match_results',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html',1,'std::match_results< _Bi_iter, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a71da2bf97751acc14fe35dd77013485c',1,'match_results< _Bi_iter >::match_results(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a65c2c5b7bac305ad0c09cc96b3f39d71',1,'match_results< _Bi_iter >::match_results(match_results &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ad83ac42bb1d27df742e20884719b7359',1,'match_results< _Bi_iter >::match_results()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6eae2dd42c7d50268871d04fb640759d',1,'match_results< _Bi_iter >::match_results(const allocator< sub_match< _Bi_iter > > &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ad83ac42bb1d27df742e20884719b7359',1,'match_results< _Bi_iter >::match_results()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6eae2dd42c7d50268871d04fb640759d',1,'match_results< _Bi_iter >::match_results(const allocator< sub_match< _Bi_iter > > &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a71da2bf97751acc14fe35dd77013485c',1,'std::match_results::match_results(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a65c2c5b7bac305ad0c09cc96b3f39d71',1,'std::match_results::match_results(match_results &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ad83ac42bb1d27df742e20884719b7359',1,'std::match_results::match_results()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6eae2dd42c7d50268871d04fb640759d',1,'std::match_results::match_results(const _Alloc &__a) noexcept']]], + ['match_5fresults_3c_20_5fbi_5fiter_20_3e_347',['match_results< _Bi_iter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html',1,'']]], + ['matchasync_348',['matchAsync',['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#aad20d402f63e8d01cbf881476ea1a798',1,'cv::cuda::DescriptorMatcher::matchAsync(InputArray queryDescriptors, InputArray trainDescriptors, OutputArray matches, InputArray mask=noArray(), Stream &stream=Stream::Null())=0'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a4d255fb28411740971a763747109d4e3',1,'cv::cuda::DescriptorMatcher::matchAsync(InputArray queryDescriptors, OutputArray matches, const std::vector< GpuMat > &masks=std::vector< GpuMat >(), Stream &stream=Stream::Null())=0']]], + ['matchclass_349',['matchClass',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a189b904ea0b9e500c5c64a52da9ec73c',1,'cv::linemod::Detector']]], + ['matchconvert_350',['matchConvert',['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a567592e9866ee163c353acc39850a7fb',1,'cv::cuda::DescriptorMatcher']]], + ['matchers_351',['Descriptor Matchers',['https://docs.opencv.org/4.2.0/d8/d9b/group__features2d__match.html',1,'']]], + ['matchers_2ehpp_352',['matchers.hpp',['https://docs.opencv.org/4.2.0/d3/dc9/matchers_8hpp.html',1,'']]], + ['matchertype_353',['MatcherType',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3b',1,'cv::DescriptorMatcher']]], + ['matches_354',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], + ['matches_355',['matches',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#a36e0824c319b6a9d7ea3eab66e27b6d0',1,'cv::detail::MatchesInfo']]], + ['matchesgraphasstring_356',['matchesGraphAsString',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gabaeb9dab170ea8066ae2583bf3a669e9',1,'cv::detail::matchesGraphAsString()'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gabaeb9dab170ea8066ae2583bf3a669e9',1,'matchesGraphAsString()(Global Namespace)']]], + ['matchesinfo_357',['MatchesInfo',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html',1,'cv::detail::MatchesInfo'],['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#aeafb1a764b2fe15f8c5c0fcd790f5d2a',1,'cv::detail::MatchesInfo::MatchesInfo()'],['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#aa99a3ff020a99c03c4016deadbf28d42',1,'cv::detail::MatchesInfo::MatchesInfo(const MatchesInfo &other)']]], + ['matchgms_358',['matchGMS',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#gaaf19e0024c555f8d8982396376150288',1,'cv::xfeatures2d::matchGMS()'],['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#gaaf19e0024c555f8d8982396376150288',1,'matchGMS(const Size &size1, const Size &size2, const std::vector< KeyPoint > &keypoints1, const std::vector< KeyPoint > &keypoints2, const std::vector< DMatch > &matches1to2, std::vector< DMatch > &matchesGMS, const bool withRotation=false, const bool withScale=false, const double thresholdFactor=6.0)(Global Namespace)']]], + ['matching_359',['Matching',['https://docs.opencv.org/4.2.0/dc/dc3/tutorial_py_matcher.html',1,'Feature Matching'],['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'Features Finding and Images Matching'],['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html',1,'cv::stereo::Matching'],['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a6fdc5a79dd5408b8d865a594f56dae2b',1,'cv::stereo::Matching::Matching(void)'],['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a07f5f3e41212ea87c0314a264ee8865b',1,'cv::stereo::Matching::Matching(int maxDisp, int scalling=4, int confidence=6)'],['https://docs.opencv.org/4.2.0/d7/dd5/group__datasets__msm.html',1,'Multiview Stereo Matching'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html',1,'Shape Distance and Matching'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html',1,'Surface Matching'],['https://docs.opencv.org/4.2.0/de/da9/tutorial_template_matching.html',1,'Template Matching'],['https://docs.opencv.org/4.2.0/d4/dc6/tutorial_py_template_matching.html',1,'Template Matching'],['https://docs.opencv.org/4.2.0/d8/dd1/tutorial_js_template_matching.html',1,'Template Matching']]], + ['matching_360',['AKAZE local features matching',['https://docs.opencv.org/4.2.0/db/d70/tutorial_akaze_matching.html',1,'']]], + ['matching_20algorithm_361',['Experimental 2D Features Matching Algorithm',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html',1,'']]], + ['matching_20homography_20to_20find_20objects_362',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], + ['matching_20with_20flann_363',['Feature Matching with FLANN',['https://docs.opencv.org/4.2.0/d5/d6f/tutorial_feature_flann_matcher.html',1,'']]], + ['matching_2ehpp_364',['matching.hpp',['https://docs.opencv.org/4.2.0/dd/ddf/matching_8hpp.html',1,'']]], + ['matchingmask_365',['matchingMask',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a4b2624192c5854601f4baebeee321c81',1,'cv::Stitcher']]], + ['matchlogos_366',['matchLOGOS',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#ga55b555fffec434bf0cdf99b454056f7b',1,'cv::xfeatures2d::matchLOGOS()'],['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#ga55b555fffec434bf0cdf99b454056f7b',1,'matchLOGOS()(Global Namespace)']]], + ['matchshapes_367',['matchShapes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaadc90cb16e2362c9bd6e7363e6e4c317',1,'cv::matchShapes()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaadc90cb16e2362c9bd6e7363e6e4c317',1,'matchShapes()(Global Namespace)']]], + ['matchtemplate_368',['matchTemplate',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#ga586ebfb0a7fb604b35a23d85391329be',1,'cv::matchTemplate()'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#ga586ebfb0a7fb604b35a23d85391329be',1,'matchTemplate()(Global Namespace)']]], + ['matchtemplatedistance_369',['MatchTemplateDistance',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1tbm_1_1MatchTemplateDistance.html',1,'cv::tbm::MatchTemplateDistance'],['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1tbm_1_1MatchTemplateDistance.html#a585d8ca37c334ef9d29c93a09f0c94cd',1,'cv::tbm::MatchTemplateDistance::MatchTemplateDistance()']]], + ['matcommainitializer_5f_370',['MatCommaInitializer_',['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html',1,'cv::MatCommaInitializer_< _Tp >'],['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html#a4feb484303b5f8d2a6198caed71d8841',1,'cv::MatCommaInitializer_::MatCommaInitializer_()']]], + ['matconstiterator_371',['MatConstIterator',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html',1,'cv::MatConstIterator'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a11c8b512e764c96c1e4ec6519df84503',1,'cv::MatConstIterator::MatConstIterator()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#adeb2d3232dd4fa391e9737d5ae079c33',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ac18a34a9c94f8a1f62a7f5e514c357be',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m, int _row, int _col=0)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a8dae0cd35279f7707dc8087374549c44',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m, Point _pt)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a1057d9eb074d77ff7b87566aebcb88b3',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m, const int *_idx)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a9635c2a5d18f3b875d98c8cef90fc9b5',1,'cv::MatConstIterator::MatConstIterator(const MatConstIterator &it)']]], + ['matconstiterator_5f_372',['MatConstIterator_',['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html',1,'cv::MatConstIterator_< _Tp >'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a452adcda3e2fb13eaf6f53456e6686e7',1,'cv::MatConstIterator_::MatConstIterator_()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#aeb5d9d2b765c182be0b731ff8bfedc11',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#aba7a798f9ea3adeb24dc358a60cac7a1',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m, int _row, int _col=0)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a6f2a3324d41f00c57f5f52bd2dc54356',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m, Point _pt)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ac3fcc7f48d7159e32d277bfcdf8bc485',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m, const int *_idx)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#aa8e7fdafb5cf5b8c7561477b3aebea33',1,'cv::MatConstIterator_::MatConstIterator_(const MatConstIterator_ &it)']]], + ['material_5fdiffuse_373',['MATERIAL_DIFFUSE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa168d81aafad40e07dbee4d6158be1db0',1,'cv::ovis::MATERIAL_DIFFUSE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa168d81aafad40e07dbee4d6158be1db0',1,'MATERIAL_DIFFUSE(Global Namespace)']]], + ['material_5femissive_374',['MATERIAL_EMISSIVE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aab4e1e8ad6c2625eeed92f18edba3b405',1,'cv::ovis::MATERIAL_EMISSIVE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aab4e1e8ad6c2625eeed92f18edba3b405',1,'MATERIAL_EMISSIVE(Global Namespace)']]], + ['material_5fline_5fwidth_375',['MATERIAL_LINE_WIDTH',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa20b84ae789e1989a24a67a5248dbca3b',1,'cv::ovis::MATERIAL_LINE_WIDTH'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa20b84ae789e1989a24a67a5248dbca3b',1,'MATERIAL_LINE_WIDTH(Global Namespace)']]], + ['material_5fopacity_376',['MATERIAL_OPACITY',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa338c9d0436bf767e82cab713d92af513',1,'cv::ovis::MATERIAL_OPACITY'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa338c9d0436bf767e82cab713d92af513',1,'MATERIAL_OPACITY(Global Namespace)']]], + ['material_5fpoint_5fsize_377',['MATERIAL_POINT_SIZE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aae70b278b28a11f386dad827d5cb7ed65',1,'cv::ovis::MATERIAL_POINT_SIZE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aae70b278b28a11f386dad827d5cb7ed65',1,'MATERIAL_POINT_SIZE(Global Namespace)']]], + ['material_5ftexture_378',['MATERIAL_TEXTURE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa31f70ed1b004bc4fa9ac7f3a11ab9907',1,'cv::ovis::MATERIAL_TEXTURE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aa31f70ed1b004bc4fa9ac7f3a11ab9907',1,'MATERIAL_TEXTURE(Global Namespace)']]], + ['material_5ftexture0_379',['MATERIAL_TEXTURE0',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aafc0e368296f231ebe9a63a6537bde448',1,'cv::ovis::MATERIAL_TEXTURE0'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aafc0e368296f231ebe9a63a6537bde448',1,'MATERIAL_TEXTURE0(Global Namespace)']]], + ['material_5ftexture1_380',['MATERIAL_TEXTURE1',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aaab1a6ff1107ddafd430962038b564730',1,'cv::ovis::MATERIAL_TEXTURE1'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aaab1a6ff1107ddafd430962038b564730',1,'MATERIAL_TEXTURE1(Global Namespace)']]], + ['material_5ftexture2_381',['MATERIAL_TEXTURE2',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aaf94fc18d5fcf12e801f06b38ab66e2e3',1,'cv::ovis::MATERIAL_TEXTURE2'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aaf94fc18d5fcf12e801f06b38ab66e2e3',1,'MATERIAL_TEXTURE2(Global Namespace)']]], + ['material_5ftexture3_382',['MATERIAL_TEXTURE3',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aab9dc60eae5d97342078e8c170c9c3e22',1,'cv::ovis::MATERIAL_TEXTURE3'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggaea70a6f274f75325488b51c14578620aab9dc60eae5d97342078e8c170c9c3e22',1,'MATERIAL_TEXTURE3(Global Namespace)']]], + ['materialproperty_383',['MaterialProperty',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gaea70a6f274f75325488b51c14578620a',1,'cv::ovis::MaterialProperty'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gaea70a6f274f75325488b51c14578620a',1,'MaterialProperty(Global Namespace)']]], + ['matexpr_384',['MatExpr',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html',1,'cv::MatExpr'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a667e294461d09da9a1b1760d33adbbc8',1,'cv::MatExpr::MatExpr()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a18f051615e9350438ef369c9dca01e6a',1,'cv::MatExpr::MatExpr(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae38c3e856d93e7cffb9f14c894a76c17',1,'cv::MatExpr::MatExpr(const MatOp *_op, int _flags, const Mat &_a=Mat(), const Mat &_b=Mat(), const Mat &_c=Mat(), double _alpha=1, double _beta=1, const Scalar &_s=Scalar())']]], + ['math_20functions_385',['Catalog of coefficient-wise math functions',['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'']]], + ['math_20operations_386',['Graph API: Math operations',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html',1,'']]], + ['math_20with_20f0_20transform_20support_387',['Math with F0-transform support',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html',1,'']]], + ['math_20with_20f1_20transform_20support_388',['Math with F1-transform support',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html',1,'']]], + ['math_2eh_389',['math.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00011.html',1,'']]], + ['matheader_390',['MatHeader',['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html',1,'cv::gapi::own::detail::MatHeader'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a4c70f10de37911136c772a2a757c7330',1,'cv::gapi::own::detail::MatHeader::MatHeader()=default'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a96dd538e3f126b1345d1e51f26725f75',1,'cv::gapi::own::detail::MatHeader::MatHeader(int _rows, int _cols, int type, void *_data, size_t _step)'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a102f051bfd010997f96a90d8be931a9c',1,'cv::gapi::own::detail::MatHeader::MatHeader(const std::vector< int > &_dims, int type, void *_data)'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a1312f98f9299bba8f423babcab4cfb3a',1,'cv::gapi::own::detail::MatHeader::MatHeader(const MatHeader &)=default'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#adcb44c4766a33685aaf9550b4450d827',1,'cv::gapi::own::detail::MatHeader::MatHeader(MatHeader &&src)']]], + ['mathematical_20special_20functions_391',['Mathematical Special Functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html',1,'Mathematical Special Functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html',1,'Mathematical Special Functions']]], + ['mathematics_392',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], + ['matiterator_5f_393',['MatIterator_',['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html',1,'cv::MatIterator_< _Tp >'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a309c4d310a2feea6f2153ae163057554',1,'cv::MatIterator_::MatIterator_()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ae7e45a26abfc2e14887f63016a6f625e',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a2535ef5b07ad7eeb66c502802ed87cb4',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m, int _row, int _col=0)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a2819a88c03e10d4eb34e104360080b01',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m, Point _pt)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a58e15db8d9e0631fdfe4a397e11523f3',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m, const int *_idx)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a7a90a2116ed74e442d38959b31990bbf',1,'cv::MatIterator_::MatIterator_(const MatIterator_ &it)']]], + ['matmul_394',['matmul',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#affcfaf5b1087ec3359583a9a7a38f9f0',1,'cv::MatOp']]], + ['matmulderiv_395',['matMulDeriv',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga905541c1275852eabff7dbdfbc10d160',1,'cv::matMulDeriv()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga905541c1275852eabff7dbdfbc10d160',1,'matMulDeriv()(Global Namespace)']]], + ['matop_396',['MatOp',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html',1,'cv::MatOp'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ac6eeff02c5ef401a8c1dcd150551f004',1,'cv::MatOp::MatOp()']]], + ['matrices_397',['Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'Arithm Operations on Matrices'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'Core Operations on Matrices'],['https://docs.opencv.org/4.2.0/d5/d8e/group__cudaarithm.html',1,'Operations on Matrices']]], + ['matrices_398',['matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'Graph API: Operations on matrices'],['https://docs.opencv.org/4.2.0/d7/d37/tutorial_mat_mask_operations.html',1,'Mask operations on matrices'],['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'Quick reference guide for sparse matrices']]], + ['matrix_399',['Matrix',['https://eigen.tuxfamily.org/dox/TopicCustomizing_InheritingMatrix.html',1,'Inheriting from Matrix'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen::Matrix< class, _Rows, _Cols, _Options, _MaxRows, _MaxCols >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Eigen::Matrix::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Eigen::Matrix::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Eigen::Matrix::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Eigen::Matrix::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Eigen::Matrix::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Eigen::Matrix::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Eigen::Matrix::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Eigen::Matrix::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Eigen::Matrix::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Eigen::Matrix::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Eigen::Matrix::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Eigen::Matrix::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Eigen::Matrix::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, 3, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, 3, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, 3, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, 3, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, 3, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, 3, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, 3, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Dim, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Dim, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Dim, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Dim, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Dim, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Dim, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Dynamic, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index rows, Index cols)']]], + ['matrix_400',['matrix',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ad122a1f67e7b1d20fd2cb511f2fe7d5d',1,'cv::Affine3::matrix'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ad122a1f67e7b1d20fd2cb511f2fe7d5d',1,'Affine3< float >::matrix'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#af01e9ea8087e390af8af453bbe4c276c',1,'Eigen::ArrayBase::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#af01e9ea8087e390af8af453bbe4c276c',1,'ArrayBase< ArrayWrapper< ExpressionType > >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'Eigen::RotationBase::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< AngleAxis< _Scalar >, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Derived, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Rotation2D< _Scalar >, 2 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a758fbaf6aa41a5493659aa0c9bfe0dcf',1,'Eigen::Transform::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a0ac079dc1995058cbbded553b8d4485c',1,'Eigen::Transform::matrix() const']]], + ['matrix_20and_20array_20manipulation_401',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], + ['matrix_20and_20vector_20arithmetic_402',['Matrix and vector arithmetic',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixArithmetic.html',1,'']]], + ['matrix_20class_403',['The Matrix class',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixClass.html',1,'']]], + ['matrix_20decomposition_404',['matrix decomposition',['https://docs.opencv.org/4.2.0/d8/d0e/group__core__hal__interface__decomp__cholesky.html',1,'Cholesky matrix decomposition'],['https://docs.opencv.org/4.2.0/d5/d42/group__core__hal__interface__decomp__lu.html',1,'LU matrix decomposition'],['https://docs.opencv.org/4.2.0/db/d36/group__core__hal__interface__decomp__qr.html',1,'QR matrix decomposition'],['https://docs.opencv.org/4.2.0/dd/d2a/group__core__hal__interface__decomp__svd.html',1,'Singular value matrix decomposition']]], + ['matrix_20decompositions_405',['Inplace matrix decompositions',['https://eigen.tuxfamily.org/dox/group__InplaceDecomposition.html',1,'']]], + ['matrix_20free_20solvers_406',['Matrix-free solvers',['https://eigen.tuxfamily.org/dox/group__MatrixfreeSolverExample.html',1,'']]], + ['matrix_20manipulation_20via_20nullary_20expressions_407',['Matrix manipulation via nullary-expressions',['https://eigen.tuxfamily.org/dox/TopicCustomizing_NullaryExpr.html',1,'']]], + ['matrix_20manipulations_408',['Sparse matrix manipulations',['https://eigen.tuxfamily.org/dox/group__TutorialSparse.html',1,'']]], + ['matrix_20multiplication_409',['Matrix multiplication',['https://docs.opencv.org/4.2.0/d2/dab/group__core__hal__interface__matrix__multiplication.html',1,'']]], + ['matrix_20product_20expressions_410',['Writing efficient matrix product expressions',['https://eigen.tuxfamily.org/dox/TopicWritingEfficientProductExpression.html',1,'']]], + ['matrix_20reductions_411',['Matrix Reductions',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html',1,'']]], + ['matrix_20typedefs_412',['Global matrix typedefs',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html',1,'']]], + ['matrix_2eh_413',['matrix.h',['https://docs.opencv.org/4.2.0/dd/df4/matrix_8h.html',1,'']]], + ['matrix2_414',['Matrix2',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga73a2c673745de956e66d30ad61fd4a7e',1,'Eigen::Matrix2'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga73a2c673745de956e66d30ad61fd4a7e',1,'Matrix2(Global Namespace)']]], + ['matrix2x_415',['Matrix2X',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga9fc5afaeb88d6cd4f2503dd6127b1ba8',1,'Eigen::Matrix2X'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga9fc5afaeb88d6cd4f2503dd6127b1ba8',1,'Matrix2X(Global Namespace)']]], + ['matrix3_416',['Matrix3',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac3972e6cb0f56cccbe9e3946a7e494f8',1,'Eigen::QuaternionBase::Matrix3'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac3972e6cb0f56cccbe9e3946a7e494f8',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::Matrix3'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac3972e6cb0f56cccbe9e3946a7e494f8',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::Matrix3'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac3972e6cb0f56cccbe9e3946a7e494f8',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::Matrix3'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga6d61b8a0039eeb04e6faf382b8635a7a',1,'Eigen::Matrix3'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga6d61b8a0039eeb04e6faf382b8635a7a',1,'Matrix3(Global Namespace)']]], + ['matrix3x_417',['Matrix3X',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gab22d239b05eafe7ac235325d454e7530',1,'Eigen::Matrix3X'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gab22d239b05eafe7ac235325d454e7530',1,'Matrix3X(Global Namespace)']]], + ['matrix4_418',['Matrix4',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga946841161df693bb792644ba410aa0f0',1,'Eigen::Matrix4'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga946841161df693bb792644ba410aa0f0',1,'Matrix4(Global Namespace)']]], + ['matrix4x_419',['Matrix4X',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga93eea03ee4428402191f86ef2239975e',1,'Eigen::Matrix4X'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga93eea03ee4428402191f86ef2239975e',1,'Matrix4X(Global Namespace)']]], + ['matrix_3c_20complexscalar_2c_20colsatcompiletime_2c_201_2c_20options_20_26_28_7erowmajor_29_2c_20maxcolsatcompiletime_2c_201_20_3e_420',['Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20complexscalar_2c_20colsatcompiletime_2c_201_2c_20options_20_26_7erowmajor_2c_20maxcolsatcompiletime_2c_201_20_3e_421',['Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20complexscalar_2c_20rowsatcompiletime_2c_20colsatcompiletime_2c_20options_2c_20maxrowsatcompiletime_2c_20maxcolsatcompiletime_20_3e_422',['Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20dim_20_3e_423',['Matrix< dim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], + ['matrix_3c_20double_2c_20outputdim_2c_20outputdim_20_3e_424',['Matrix< double, outputDim, outputDim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], + ['matrix_3c_20double_2c_20outputdim_2c_20statedim_20_3e_425',['Matrix< double, outputDim, stateDim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], + ['matrix_3c_20double_2c_20statedim_2c_201_20_3e_426',['Matrix< double, stateDim, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], + ['matrix_3c_20double_2c_20statedim_2c_20inputdim_20_3e_427',['Matrix< double, stateDim, inputDim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], + ['matrix_3c_20double_2c_20statedim_2c_20outputdim_20_3e_428',['Matrix< double, stateDim, outputDim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], + ['matrix_3c_20double_2c_20statedim_2c_20statedim_20_3e_429',['Matrix< double, stateDim, stateDim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], + ['matrix_3c_20int_2c_201_2c_20matrixtype_3a_3acolsatcompiletime_20_3e_430',['Matrix< int, 1, MatrixType::ColsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20int_2c_20matrixtype_3a_3arowsatcompiletime_2c_201_20_3e_431',['Matrix< int, MatrixType::RowsAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20n_20_3e_432',['Matrix< N >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], + ['matrix_3c_20outputdim_20_3e_433',['Matrix< outputDim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'Eigen']]], + ['matrix_3c_20realscalar_2c_20dynamic_2c_201_20_3e_434',['Matrix< RealScalar, Dynamic, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20realscalar_2c_20dynamic_2c_20dynamic_2c_20colmajor_20_3e_435',['Matrix< RealScalar, Dynamic, Dynamic, ColMajor >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_201_2c_20size_2c_20options_7crowmajor_2c_201_2c_20maxsize_20_3e_436',['Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_203_2c_201_20_3e_437',['Matrix< Scalar, 3, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_20ambientdimatcompiletime_2c_201_20_3e_438',['Matrix< Scalar, AmbientDimAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_20ambientdimatcompiletime_2c_201_2c_20options_20_3e_439',['Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_20colsatcompiletime_2c_201_2c_20options_20_26_7erowmajor_2c_20maxcolsatcompiletime_2c_201_20_3e_440',['Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_20colsatcompiletime_2c_20colsatcompiletime_2c_20matrixoptions_2c_20maxcolsatcompiletime_2c_20maxcolsatcompiletime_20_3e_441',['Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_20diagsizeatcompiletime_2c_20diagsizeatcompiletime_2c_20matrixoptions_2c_20maxdiagsizeatcompiletime_2c_20maxdiagsizeatcompiletime_20_3e_442',['Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_20dim_2c_201_20_3e_443',['Matrix< Scalar, Dim, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_20dynamic_2c_201_20_3e_444',['Matrix< Scalar, Dynamic, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_20index_28ambientdimatcompiletime_29_3d_3ddynamic_20_3f_20dynamic_20_3aindex_28ambientdimatcompiletime_29_2b1_2c_201_2c_20options_20_3e_445',['Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_20rowsatcompiletime_2c_201_2c_200_2c_20maxrowsatcompiletime_2c_201_20_3e_446',['Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_20rowsatcompiletime_2c_20rowsatcompiletime_2c_20matrixoptions_2c_20maxrowsatcompiletime_2c_20maxrowsatcompiletime_20_3e_447',['Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_20size_2c_20size_2c_20colmajor_2c_20maxcolsatcompiletime_2c_20maxcolsatcompiletime_20_3e_448',['Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20scalar_2c_20sizeminusone_2c_201_2c_20options_20_26_7erowmajor_2c_20maxsizeminusone_2c_201_20_3e_449',['Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20storageindex_2c_201_2c_20eigen_5fsize_5fmin_5fprefer_5fdynamic_28colsatcompiletime_2c_20rowsatcompiletime_29_2c_20rowmajor_2c_201_2c_20eigen_5fsize_5fmin_5fprefer_5ffixed_28maxcolsatcompiletime_2c_20maxrowsatcompiletime_29_3e_450',['Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20storageindex_2c_20dynamic_2c_201_20_3e_451',['Matrix< StorageIndex, Dynamic, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrix_3c_20storageindex_2c_20matrixtype_3a_3arowsatcompiletime_2c_201_20_3e_452',['Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html',1,'']]], + ['matrixbase_453',['MatrixBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html',1,'Eigen']]], + ['matrixbase_20and_20other_20classes_454',['Extending MatrixBase (and other classes)',['https://eigen.tuxfamily.org/dox/TopicCustomizing_Plugins.html',1,'']]], + ['matrixbase_3c_20homogeneous_3c_20matrixtype_2c_20_5fdirection_20_3e_20_3e_455',['MatrixBase< Homogeneous< MatrixType, _Direction > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html',1,'']]], + ['matrixbase_3c_20solve_3c_20decomposition_2c_20rhstype_20_3e_20_3e_456',['MatrixBase< Solve< Decomposition, RhsType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html',1,'']]], + ['matrixfunction_457',['matrixFunction',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1a6cc9f734eb175e785a1118305245fc',1,'Eigen::MatrixBase::matrixFunction()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1a6cc9f734eb175e785a1118305245fc',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::matrixFunction()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1a6cc9f734eb175e785a1118305245fc',1,'MatrixBase< Solve< Decomposition, RhsType > >::matrixFunction()']]], + ['matrixh_458',['matrixH',['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a8e781d2e22a2304647bcf0ae913cc8ea',1,'Eigen::HessenbergDecomposition::matrixH()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a8e781d2e22a2304647bcf0ae913cc8ea',1,'HessenbergDecomposition< MatrixType >::matrixH()']]], + ['matrixl_459',['matrixL',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a7d1f1878505fd1862e6f2286d27ff09a',1,'Eigen::IncompleteCholesky::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#af0e6a0df5679873b42cf82a372dd8ddb',1,'Eigen::LDLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a7f4a3eedbf82e7ce2d6bf0dcd84cdfa3',1,'Eigen::LLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a80dfe1f4b4c8991252178de385e310bc',1,'Eigen::SimplicialLDLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a232f994f0106fa405c4066f7dbf81c95',1,'Eigen::SimplicialLLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a35df62f4c1f7ed32f6ac39d94701b9a8',1,'Eigen::SparseLU::matrixL()']]], + ['matrixldlt_460',['matrixLDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#aa5e0fd09dcd5251a8521fa248b95db0b',1,'Eigen::LDLT']]], + ['matrixllt_461',['matrixLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#af62881fc95c7e54a93b63c20f2c62b46',1,'Eigen::LLT']]], + ['matrixlu_462',['matrixLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#afea0b8fc707a9097d46fe358cb18bbff',1,'Eigen::FullPivLU::matrixLU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#abea0d7e51c5591a6db152eade0892d9c',1,'Eigen::PartialPivLU::matrixLU()']]], + ['matrixq_463',['matrixQ',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#ad26dd2d3c002939771d2375e4e051c28',1,'Eigen::FullPivHouseholderQR::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a346441e4902a58d43d698ac3da6ff791',1,'Eigen::HessenbergDecomposition::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a346441e4902a58d43d698ac3da6ff791',1,'HessenbergDecomposition< MatrixType >::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a212bc2f69ea4eff830fde70e209e40fb',1,'Eigen::RealQZ::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a212bc2f69ea4eff830fde70e209e40fb',1,'RealQZ< MatrixType >::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a348c5c00788b912c2bcb3e80be467877',1,'Eigen::SparseQR::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a4179a9d595d9bd58a649ef695b3db3c3',1,'Eigen::SPQR::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a000f7392eda930576ffd2af1fae54af2',1,'Eigen::Tridiagonalization::matrixQ()']]], + ['matrixqr_464',['matrixQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aa572ac050c8d4fadd4f08a87f6b1e62b',1,'Eigen::ColPivHouseholderQR::matrixQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aa572ac050c8d4fadd4f08a87f6b1e62b',1,'ColPivHouseholderQR< MatrixType >::matrixQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a9c16411e5d8f1fc634a5797018d5aa3e',1,'Eigen::FullPivHouseholderQR::matrixQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#ae837f2fb30099212c53b3042c7d699c9',1,'Eigen::HouseholderQR::matrixQR()']]], + ['matrixqtz_465',['matrixQTZ',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ad89e2529fc1a8721239d9b6be9613a69',1,'Eigen::CompleteOrthogonalDecomposition']]], + ['matrixr_466',['matrixR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a44c534d47bde6b67ce4b5247d142ef30',1,'Eigen::ColPivHouseholderQR::matrixR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a44c534d47bde6b67ce4b5247d142ef30',1,'ColPivHouseholderQR< MatrixType >::matrixR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#abe62644e0879b3e75836d63edf623899',1,'Eigen::SparseQR::matrixR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a99389f43e9eebe0b222e3b75318046e5',1,'Eigen::SPQR::matrixR()']]], + ['matrixs_467',['matrixS',['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ad24d7bf534afb55adaef00f00846adaf',1,'Eigen::RealQZ::matrixS()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ad24d7bf534afb55adaef00f00846adaf',1,'RealQZ< MatrixType >::matrixS()']]], + ['matrixt_468',['matrixT',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a806213f5c96ff765265f47067229586d',1,'Eigen::CompleteOrthogonalDecomposition::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#add3ab5ed83f7f2f06b79fa910a2d5684',1,'Eigen::ComplexSchur::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#add3ab5ed83f7f2f06b79fa910a2d5684',1,'ComplexSchur< MatrixType >::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a8dc963d8ea2a17df9d8d718e9e34d06f',1,'Eigen::RealQZ::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a8dc963d8ea2a17df9d8d718e9e34d06f',1,'RealQZ< MatrixType >::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#abb78996b43b8642a5f507415730445cb',1,'Eigen::RealSchur::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#abb78996b43b8642a5f507415730445cb',1,'RealSchur< MatrixType >::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a6eb5ef94b8b9bb013c0e69b6df56d0df',1,'Eigen::Tridiagonalization::matrixT()']]], + ['matrixtype_469',['MatrixType',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#ad61f6278843a601096276c9a72c0252f',1,'Eigen::ComplexEigenSolver::MatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a83acd180404ddaac8a678fa65a6b632b',1,'Eigen::EigenSolver::MatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#a56f4b9823bb9a267de3aaf48428cd247',1,'Eigen::GeneralizedEigenSolver::MatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a93a611350a7db9d1da18f2c828ecea9f',1,'Eigen::HessenbergDecomposition::MatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a93a611350a7db9d1da18f2c828ecea9f',1,'HessenbergDecomposition< MatrixType >::MatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a30f72ba46abc2bb3c7fa919c1078fc9c',1,'Eigen::Transform::MatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#add0f4b2216d0ea8ee0f7d8525deaf0a9',1,'Eigen::Tridiagonalization::MatrixType']]], + ['matrixu_470',['matrixU',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#afed8177cf9836f032d42bdb6c6bc6e01',1,'Eigen::ComplexSchur::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#afed8177cf9836f032d42bdb6c6bc6e01',1,'ComplexSchur< MatrixType >::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a54838a2e31e53bbe4dcb78b5e80c8484',1,'Eigen::LDLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a18a390f085567e650e8345cc7e7c0df8',1,'Eigen::LLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a85622ccbecff99c8933d21f0a22b22bb',1,'Eigen::RealSchur::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a85622ccbecff99c8933d21f0a22b22bb',1,'RealSchur< MatrixType >::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#ab486c0cd928c8b0c1c20c314f0963ad0',1,'Eigen::SimplicialLDLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a173073880c5fc17661b4505259de4aa1',1,'Eigen::SimplicialLLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a5aa9a62f8d2c593a5817f4bc77c3e276',1,'Eigen::SparseLU::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#afc7fe1546b0f6e1801b86f22f5664cb8',1,'Eigen::SVDBase::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#afc7fe1546b0f6e1801b86f22f5664cb8',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::matrixU()']]], + ['matrixv_471',['matrixV',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a245a453b5e7347f737295c23133238c4',1,'Eigen::SVDBase::matrixV()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a245a453b5e7347f737295c23133238c4',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::matrixV()']]], + ['matrixwrapper_472',['MatrixWrapper',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixWrapper.html',1,'Eigen']]], + ['matrixx_473',['MatrixX',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga8a779d79defc9f822fa6ff5869c2ba6b',1,'Eigen::MatrixX'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga8a779d79defc9f822fa6ff5869c2ba6b',1,'MatrixX(Global Namespace)']]], + ['matrixx2_474',['MatrixX2',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga1d162ebb520e589b3a5a5f4024aa3ae4',1,'Eigen::MatrixX2'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga1d162ebb520e589b3a5a5f4024aa3ae4',1,'MatrixX2(Global Namespace)']]], + ['matrixx3_475',['MatrixX3',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gacdb4b32de62bf47373eec29612b73657',1,'Eigen::MatrixX3'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gacdb4b32de62bf47373eec29612b73657',1,'MatrixX3(Global Namespace)']]], + ['matrixx4_476',['MatrixX4',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gabe35b438cb4f39d72092d1fbb16153b8',1,'Eigen::MatrixX4'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gabe35b438cb4f39d72092d1fbb16153b8',1,'MatrixX4(Global Namespace)']]], + ['matrixxpr_477',['MatrixXpr',['https://eigen.tuxfamily.org/dox/structEigen_1_1MatrixXpr.html',1,'Eigen']]], + ['matrixz_478',['matrixZ',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a4cd178f13aefe5189d4beeb3eb1c5897',1,'Eigen::CompleteOrthogonalDecomposition::matrixZ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a19a116383f11423179b4d8f316da6f67',1,'Eigen::RealQZ::matrixZ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a19a116383f11423179b4d8f316da6f67',1,'RealQZ< MatrixType >::matrixZ()']]], + ['matshape_479',['MatShape',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga8a9ab61770c140f0fa2880c90aeae832',1,'cv::dnn::MatShape'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga8a9ab61770c140f0fa2880c90aeae832',1,'MatShape(Global Namespace)']]], + ['matsize_480',['MatSize',['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html',1,'cv::MatSize'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a5e739605f00e00e40d5c0dca366c3fcd',1,'cv::MatSize::MatSize()']]], + ['matstep_481',['MatStep',['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html',1,'cv::MatStep'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a3ad7985df6dfb840590bb1442ed36e50',1,'cv::MatStep::MatStep()'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#ad38cde803142727c157a4b8050de2a16',1,'cv::MatStep::MatStep(size_t s)']]], + ['mattouiimage_482',['MatToUIImage',['https://docs.opencv.org/4.2.0/d2/d92/group__imgcodecs__ios.html#ga99a095c2334fd8bf933382f1cad12416',1,]]], + ['matx_483',['MATX',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba52401c0e7c2c1bd3e55d86f06b529279',1,'cv::_InputArray']]], + ['matx_484',['Matx',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< _Tp, m, n >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'cv::Matx::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'cv::Matx::Matx(_Tp v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'cv::Matx::Matx(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13, _Tp v14, _Tp v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'cv::Matx::Matx(const _Tp *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'cv::Matx::Matx(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'cv::Matx::Matx(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'cv::Matx::Matx(const Matx< _Tp, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< _Tp, cn, 1 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13, _Tp v14, _Tp v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< _Tp, cn, 1 >::Matx(const _Tp *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< _Tp, cn, 1 >::Matx(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 1, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 1, 3 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 1, 3 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 1, 3 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 1, 3 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 1, 3 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 2, 2 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 2, 2 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 2, 2 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 2, 2 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 2, 2 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 2, 2 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 2, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 2, 3 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 2, 3 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 2, 3 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 2, 3 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 2, 3 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 3, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 3, 3 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 3, 3 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 3, 3 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 3, 3 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 3, 3 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 3, 4 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 3, 4 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 3, 4 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 3, 4 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 3, 4 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 3, 4 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 4, 4 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 4, 4 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 4, 4 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 4, 4 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 4, 4 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 4, 4 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, cn, 1 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, cn, 1 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, cn, 1 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, cn, 1 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, cn, 1 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, cn, 1 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float, 2, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float, 2, 3 >::Matx(float v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float, 2, 3 >::Matx(float v0, float v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13, float v14, float v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float, 2, 3 >::Matx(const float *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float, 2, 3 >::Matx(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, l > &a, const Matx< float, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float, 2, 3 >::Matx(const Matx< float, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float, 3, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float, 3, 3 >::Matx(float v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float, 3, 3 >::Matx(float v0, float v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13, float v14, float v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float, 3, 3 >::Matx(const float *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float, 3, 3 >::Matx(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, l > &a, const Matx< float, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float, 3, 3 >::Matx(const Matx< float, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float, cn, 1 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float, cn, 1 >::Matx(float v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float, cn, 1 >::Matx(float v0, float v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13, float v14, float v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float, cn, 1 >::Matx(const float *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float, cn, 1 >::Matx(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, l > &a, const Matx< float, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float, cn, 1 >::Matx(const Matx< float, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float_type, 4, 4 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float_type, 4, 4 >::Matx(float_type v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9, float_type v10, float_type v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9, float_type v10, float_type v11, float_type v12, float_type v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9, float_type v10, float_type v11, float_type v12, float_type v13, float_type v14, float_type v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float_type, 4, 4 >::Matx(const float_type *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float_type, 4, 4 >::Matx(std::initializer_list< float_type >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, l > &a, const Matx< float_type, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, n, m > &a, Matx_TOp)']]], + ['matx_2ehpp_485',['matx.hpp',['https://docs.opencv.org/4.2.0/dc/d09/matx_8hpp.html',1,'']]], + ['matx12d_486',['Matx12d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2e67dac932ed81c0c90e3d658c0f7033',1,'cv::Matx12d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2e67dac932ed81c0c90e3d658c0f7033',1,'Matx12d(Global Namespace)']]], + ['matx12f_487',['Matx12f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3a2cc9d733bf60e0200fa46196805153',1,'cv::Matx12f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3a2cc9d733bf60e0200fa46196805153',1,'Matx12f(Global Namespace)']]], + ['matx13d_488',['Matx13d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga765ff587743f231c87ffa708f6f76b96',1,'cv::Matx13d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga765ff587743f231c87ffa708f6f76b96',1,'Matx13d(Global Namespace)']]], + ['matx13f_489',['Matx13f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0af99d4dbb40a817429f3039700f8a33',1,'cv::Matx13f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0af99d4dbb40a817429f3039700f8a33',1,'Matx13f(Global Namespace)']]], + ['matx14d_490',['Matx14d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3a3e911d56f0e29d34cca18548bfdbbf',1,'cv::Matx14d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3a3e911d56f0e29d34cca18548bfdbbf',1,'Matx14d(Global Namespace)']]], + ['matx14f_491',['Matx14f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf1a460d05e81b372d31b50169ec289d6',1,'cv::Matx14f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf1a460d05e81b372d31b50169ec289d6',1,'Matx14f(Global Namespace)']]], + ['matx16d_492',['Matx16d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3afc2be04e64e50bd58296878ec38a1b',1,'cv::Matx16d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3afc2be04e64e50bd58296878ec38a1b',1,'Matx16d(Global Namespace)']]], + ['matx16f_493',['Matx16f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7cf48157727556c640df2854f11ff91a',1,'cv::Matx16f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7cf48157727556c640df2854f11ff91a',1,'Matx16f(Global Namespace)']]], + ['matx21d_494',['Matx21d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga088ad84a55a0fa104ccb9f828dc38299',1,'cv::Matx21d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga088ad84a55a0fa104ccb9f828dc38299',1,'Matx21d(Global Namespace)']]], + ['matx21f_495',['Matx21f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga37e9c8ab7c9ccf91d4b512c656664886',1,'cv::Matx21f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga37e9c8ab7c9ccf91d4b512c656664886',1,'Matx21f(Global Namespace)']]], + ['matx22d_496',['Matx22d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga10d0d07f3ac00f086e0fc532790ccc8c',1,'cv::Matx22d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga10d0d07f3ac00f086e0fc532790ccc8c',1,'Matx22d(Global Namespace)']]], + ['matx22f_497',['Matx22f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8f480b4b705baac0f2bc1a7db43809ce',1,'cv::Matx22f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8f480b4b705baac0f2bc1a7db43809ce',1,'Matx22f(Global Namespace)']]], + ['matx23d_498',['Matx23d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga392a6836e5dbc164888f4e39c7d9d9af',1,'cv::Matx23d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga392a6836e5dbc164888f4e39c7d9d9af',1,'Matx23d(Global Namespace)']]], + ['matx23f_499',['Matx23f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaa52e0258d92b0ff1be1644b061e65f66',1,'cv::Matx23f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaa52e0258d92b0ff1be1644b061e65f66',1,'Matx23f(Global Namespace)']]], + ['matx31d_500',['Matx31d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga778f9bbae8b0fe95271de44ac24083b0',1,'cv::Matx31d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga778f9bbae8b0fe95271de44ac24083b0',1,'Matx31d(Global Namespace)']]], + ['matx31f_501',['Matx31f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1625ab2c70d7f06d259f245cb5f5f4f8',1,'cv::Matx31f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1625ab2c70d7f06d259f245cb5f5f4f8',1,'Matx31f(Global Namespace)']]], + ['matx32d_502',['Matx32d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0d13e4d37f158c9e3f2d3a047849e626',1,'cv::Matx32d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0d13e4d37f158c9e3f2d3a047849e626',1,'Matx32d(Global Namespace)']]], + ['matx32f_503',['Matx32f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga6d016ebac929fa7bb2fa4f3ebdb9e953',1,'cv::Matx32f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga6d016ebac929fa7bb2fa4f3ebdb9e953',1,'Matx32f(Global Namespace)']]], + ['matx33d_504',['Matx33d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaff0100a48f049fb15584a4a657eae838',1,'cv::Matx33d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaff0100a48f049fb15584a4a657eae838',1,'Matx33d(Global Namespace)']]], + ['matx33f_505',['Matx33f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga118a383f60581636c7c8ab180cbb155e',1,'cv::Matx33f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga118a383f60581636c7c8ab180cbb155e',1,'Matx33f(Global Namespace)']]], + ['matx34d_506',['Matx34d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2ac31d988d1a8b5fb959d395dba89890',1,'cv::Matx34d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2ac31d988d1a8b5fb959d395dba89890',1,'Matx34d(Global Namespace)']]], + ['matx34f_507',['Matx34f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaec7e9859876e96fe9ee16e01b6f359b1',1,'cv::Matx34f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaec7e9859876e96fe9ee16e01b6f359b1',1,'Matx34f(Global Namespace)']]], + ['matx41d_508',['Matx41d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gafb03ffa6748e6d6e53e997e4975c6404',1,'cv::Matx41d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gafb03ffa6748e6d6e53e997e4975c6404',1,'Matx41d(Global Namespace)']]], + ['matx41f_509',['Matx41f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga9a196e7bdf588d7c685edbb330f74423',1,'cv::Matx41f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga9a196e7bdf588d7c685edbb330f74423',1,'Matx41f(Global Namespace)']]], + ['matx43d_510',['Matx43d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7db1c513c2dfacc11b83ed8a8c500304',1,'cv::Matx43d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7db1c513c2dfacc11b83ed8a8c500304',1,'Matx43d(Global Namespace)']]], + ['matx43f_511',['Matx43f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gac6f34340fe75178e5a11a77150a3303d',1,'cv::Matx43f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gac6f34340fe75178e5a11a77150a3303d',1,'Matx43f(Global Namespace)']]], + ['matx44d_512',['Matx44d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga366070cdc95233a6b6db521dfd99e713',1,'cv::Matx44d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga366070cdc95233a6b6db521dfd99e713',1,'Matx44d(Global Namespace)']]], + ['matx44f_513',['Matx44f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaaccfdd6e633076501c97b6ba4e792f53',1,'cv::Matx44f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaaccfdd6e633076501c97b6ba4e792f53',1,'Matx44f(Global Namespace)']]], + ['matx61d_514',['Matx61d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga95ed8b37f47393d8d9a50d9571c7be48',1,'cv::Matx61d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga95ed8b37f47393d8d9a50d9571c7be48',1,'Matx61d(Global Namespace)']]], + ['matx61f_515',['Matx61f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga449bf946575de9dc943e74566a0c5e7e',1,'cv::Matx61f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga449bf946575de9dc943e74566a0c5e7e',1,'Matx61f(Global Namespace)']]], + ['matx66d_516',['Matx66d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gafeab5cbf4078b280e11c59338435cd5c',1,'cv::Matx66d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gafeab5cbf4078b280e11c59338435cd5c',1,'Matx66d(Global Namespace)']]], + ['matx66f_517',['Matx66f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf1482aa6880dc74dad16683fd0ecc11e',1,'cv::Matx66f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf1482aa6880dc74dad16683fd0ecc11e',1,'Matx66f(Global Namespace)']]], + ['matx_3c_20_5ftp_2c_20cn_2c_201_20_3e_518',['Matx< _Tp, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], + ['matx_3c_20double_2c_201_2c_203_20_3e_519',['Matx< double, 1, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< double, 1, 3 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< double, 1, 3 >']]], + ['matx_3c_20double_2c_202_2c_202_20_3e_520',['Matx< double, 2, 2 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], + ['matx_3c_20double_2c_202_2c_203_20_3e_521',['Matx< double, 2, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< double, 2, 3 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< double, 2, 3 >']]], + ['matx_3c_20double_2c_203_2c_201_20_3e_522',['Matx< double, 3, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20double_2c_203_2c_203_20_3e_523',['Matx< double, 3, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< double, 3, 3 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< double, 3, 3 >']]], + ['matx_3c_20double_2c_203_2c_204_20_3e_524',['Matx< double, 3, 4 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< double, 3, 4 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< double, 3, 4 >']]], + ['matx_3c_20double_2c_204_2c_201_20_3e_525',['Matx< double, 4, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20double_2c_204_2c_204_20_3e_526',['Matx< double, 4, 4 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< double, 4, 4 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< double, 4, 4 >']]], + ['matx_3c_20double_2c_20cn_2c_201_20_3e_527',['Matx< double, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], + ['matx_3c_20double_2c_20gpcpatchdescriptor_3a_3anfeatures_2c_201_20_3e_528',['Matx< double, GPCPatchDescriptor::nFeatures, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20double_2c_20nfeatures_2c_201_20_3e_529',['Matx< double, nFeatures, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20float_2c_202_2c_201_20_3e_530',['Matx< float, 2, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20float_2c_202_2c_203_20_3e_531',['Matx< float, 2, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< float, 2, 3 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< float, 2, 3 >']]], + ['matx_3c_20float_2c_203_2c_201_20_3e_532',['Matx< float, 3, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20float_2c_203_2c_203_20_3e_533',['Matx< float, 3, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< float, 3, 3 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< float, 3, 3 >']]], + ['matx_3c_20float_2c_20cn_2c_201_20_3e_534',['Matx< float, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], + ['matx_3c_20float_5ftype_2c_204_2c_204_20_3e_535',['Matx< float_type, 4, 4 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< float_type, 4, 4 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< float_type, 4, 4 >']]], + ['matx_3c_20int_2c_203_2c_201_20_3e_536',['Matx< int, 3, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20int_2c_20cn_2c_201_20_3e_537',['Matx< int, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], + ['matxcommainitializer_538',['MatxCommaInitializer',['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html',1,'cv::MatxCommaInitializer< _Tp, m, n >'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#ad6172873d5585f6f43d6c116739c3046',1,'cv::MatxCommaInitializer::MatxCommaInitializer()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#ad6172873d5585f6f43d6c116739c3046',1,'MatxCommaInitializer< _Tp, m, 1 >::MatxCommaInitializer()']]], + ['matxcommainitializer_3c_20_5ftp_2c_20m_2c_201_20_3e_539',['MatxCommaInitializer< _Tp, m, 1 >',['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html',1,'']]], + ['max_540',['Max',['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1cudev_1_1Max.html',1,'cv::cudev::Max< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a6c39e42a5db22f2ca934f5aedcb9985f',1,'Eigen::AlignedBox::Max']]], + ['max_541',['max',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6dff8b6e9105b6d817b493e7be157c90',1,'cv::MatExpr::max(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0326ec178e9d4ca09c54b6b488fb8021',1,'cv::MatExpr::max(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4a2fa0a37cba3f21b576ae4084757fba',1,'cv::MatExpr::max(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acb1ea96bb76c4014c399ef6ba536a7b0',1,'cv::MatExpr::max(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8ee69a65a23b73a176ab5ef9a6e5d5cb',1,'cv::MatExpr::max(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6dff8b6e9105b6d817b493e7be157c90',1,'cv::MatExpr::max(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0326ec178e9d4ca09c54b6b488fb8021',1,'cv::MatExpr::max(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4a2fa0a37cba3f21b576ae4084757fba',1,'cv::MatExpr::max(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acb1ea96bb76c4014c399ef6ba536a7b0',1,'cv::MatExpr::max(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8ee69a65a23b73a176ab5ef9a6e5d5cb',1,'cv::MatExpr::max(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/da/d81/structcv_1_1cudev_1_1numeric__limits_3_01bool_01_4.html#ac703275292abf4e807a214591bcdc2d8',1,'cv::cudev::numeric_limits< bool >::max()'],['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html#a975e4945dd32c2d4d81754a930de6b32',1,'cv::cudev::numeric_limits< double >::max()'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html#a4c00407dc7ea3ba6b40e4304029889a2',1,'cv::cudev::numeric_limits< float >::max()'],['https://docs.opencv.org/4.2.0/da/d4e/structcv_1_1cudev_1_1numeric__limits_3_01schar_01_4.html#aa062933ff7ca9cac2696d885e0a395eb',1,'cv::cudev::numeric_limits< schar >::max()'],['https://docs.opencv.org/4.2.0/d1/d8b/structcv_1_1cudev_1_1numeric__limits_3_01short_01_4.html#a20f0d37fa674c928c9511f6862a0cb4e',1,'cv::cudev::numeric_limits< short >::max()'],['https://docs.opencv.org/4.2.0/d3/dc7/structcv_1_1cudev_1_1numeric__limits_3_01uchar_01_4.html#a5ca8ea65e60c6da8c38058728816a00b',1,'cv::cudev::numeric_limits< uchar >::max()'],['https://docs.opencv.org/4.2.0/dd/d89/structcv_1_1cudev_1_1numeric__limits_3_01uint_01_4.html#a1a620ff9c217ea83b33e76a4402c59d9',1,'cv::cudev::numeric_limits< uint >::max()'],['https://docs.opencv.org/4.2.0/df/d47/structcv_1_1cudev_1_1numeric__limits_3_01ushort_01_4.html#a03563b99fdf8162fb1bdd44f26dce122',1,'cv::cudev::numeric_limits< ushort >::max()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3d08b6f078ecee3862aeb01bdf0ba8b9',1,'cv::softdouble::max()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6361d683afa3e472e06a0c2e80984f00',1,'cv::softfloat::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ae00d7ad063d15bb7162da61116552175',1,'gamma_distribution< double >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ae00d7ad063d15bb7162da61116552175',1,'gamma_distribution< result_type >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8e9cd7d4bb14de188ead958d3f1faeac',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae433f04f988a93f6e835d7cf7fbbde31',1,'normal_distribution< double >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae433f04f988a93f6e835d7cf7fbbde31',1,'normal_distribution< result_type >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#a14712b344c9472eb67d2973589ddf7f2',1,'std::bernoulli_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a3699dfeea620a15824d48f712df52b0c',1,'std::binomial_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#ae5cd7dd82c78d0383e64cd19e0234c86',1,'std::cauchy_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#ab4889a7bcb116a19e0815cf2fa250263',1,'std::chi_squared_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a9a70eb71021b6dd2b675e158d76833ef',1,'std::discard_block_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a3e8e124e8cdf1f8d18b1838a5d1c9728',1,'std::discrete_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#ac4d57abc4ee818a817139259105ef090',1,'std::exponential_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#ade74f06d6ad6c6f14c988fea1b63c1bb',1,'std::extreme_value_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a06d2101e5cda9129c6632e788fe7b9b8',1,'std::fisher_f_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ae00d7ad063d15bb7162da61116552175',1,'std::gamma_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a537ddec1681bac5e12dd0aab79983072',1,'std::geometric_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#abf1815a0f69ac213aeeac81d614371e2',1,'std::independent_bits_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#af334bf0422c2d5ef522e3dac8427d63a',1,'std::linear_congruential_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#ae51c9700b0c6168babb2abdf188e50d0',1,'std::lognormal_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8e9cd7d4bb14de188ead958d3f1faeac',1,'std::mersenne_twister_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#ab6d71a4f655a8dc7b6c15f86eed3c497',1,'std::negative_binomial_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae433f04f988a93f6e835d7cf7fbbde31',1,'std::normal_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#a27b481b529885d1b1b714c7fe69a1945',1,'std::numeric_limits::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a343aaa0cdc636a60b6e224055d9df438',1,'std::piecewise_constant_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a469645104ba3c002ed9ca944110dfe2a',1,'std::piecewise_linear_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#aaba081a4614ee3ff72039cae6a476267',1,'std::poisson_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a1d0bd67aff4969f4a202719edd2c4f5b',1,'std::shuffle_order_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a3aa9a19c585c414c605558b3af9a86ec',1,'std::student_t_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#aeea39effc4518e2236214b51cc0e9f93',1,'std::subtract_with_carry_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#aa54fab480296167c634342e2f0222ef7',1,'std::uniform_int_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#aa66df100cde48499a2ba6b2cca3d1554',1,'std::uniform_real_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4e66ea69757ab2d6193e385c919e6f71',1,'std::valarray::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#ab2f82c4a4ca1feff71630626710d865e',1,'std::weibull_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4e66ea69757ab2d6193e385c919e6f71',1,'valarray< size_t >::max()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a0e0a35eb40a9079468f447c1bab8a400',1,'Eigen::AlignedBox::max()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a987d516532b24fcadc34d2f501579c73',1,'Eigen::AlignedBox::max() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga78f988f6cfa6223610298cbd4f86ec66',1,'cv::max(const softfloat &a, const softfloat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga07f4a159313983528c74d5162a56fbc9',1,'cv::max(const softdouble &a, const softdouble &b)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gacc40fa15eac0fb83f8ca70b7cc0b588d',1,'cv::max(InputArray src1, InputArray src2, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad81c37ed0b0fd23ede0cefadbf04af44',1,'cv::max(const Mat &src1, const Mat &src2, Mat &dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6eefd595055bf1ea4ba3d12f70531511',1,'cv::max(const UMat &src1, const UMat &src2, UMat &dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gadb5dd3d870f10c0866035755b929b1e7',1,'cv::cuda::max()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7edae1e0cfcb34a59e251c9b330949',1,'cv::cudev::max(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff9681cddad025c92c98529215adacb',1,'cv::cudev::max(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6432d74919e90dbda4727df485d68878',1,'cv::cudev::max(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae250eaed4ac6113528a0590afe45b099',1,'cv::cudev::max(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bd06dc616da56d71d6f238772e921e',1,'cv::cudev::max(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd2a8c631c77af12548b22aaacebc87a',1,'cv::cudev::max(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf5c19898fc50d657385caeca1ca1ede',1,'cv::cudev::max(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3763f4140dbd3501a732882e48c5102c',1,'cv::cudev::max(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8946999942e013d38872e231417093a0',1,'cv::cudev::max(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db3b60a0cbe9bc77ad3e698954a9c18',1,'cv::cudev::max(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga634efcb854017039414da832695a2533',1,'cv::cudev::max(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4adf20946d2403cdc84854e778d03a9a',1,'cv::cudev::max(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9c563261c87743c5dab045a91a61c7c',1,'cv::cudev::max(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae17404884a5f0ef7eaf56225fb604fe6',1,'cv::cudev::max(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ce2d615591426d5adb4764996698b9',1,'cv::cudev::max(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bf33fe22d6e7efb9e5faacbba1c6a45',1,'cv::cudev::max(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf91add376317b3731608216f28ab963',1,'cv::cudev::max(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0053e35915c820454ea2264d4ee7613f',1,'cv::cudev::max(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62698a80e29b75ec8505358a3799936e',1,'cv::cudev::max(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bce6ab7cccef843a7c944bbdbf63b07',1,'cv::cudev::max(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b384425584ac7c2d34bdc057e5af65',1,'cv::cudev::max(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d199235971dff02dc2959f563d23308',1,'cv::cudev::max(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga327485d656538e5fa100c599c75a1e00',1,'cv::cudev::max(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a96f99c184fabb74382774232aa3a34',1,'cv::cudev::max(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1015f0bfdd3bb605e0e9d1fd147e1df4',1,'cv::cudev::max(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bd5ed74854a11a09051de2954f15ed5',1,'cv::cudev::max(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e265a5d6affec6d1afbd2ef5f14e06',1,'cv::cudev::max(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa886e0915a0f68093092573066797ad',1,'cv::cudev::max(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49797f16c920f5d36c3174510dec72ea',1,'cv::cudev::max(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70201802b3cf2254a774fcd6a556772c',1,'cv::cudev::max(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6460dd389b726df9bb0a7bcfbdc759de',1,'cv::cudev::max(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76dd5f19b86e2c63bbd784ce53d8c3d5',1,'cv::cudev::max(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20343d119b1183a8e2c86859ebf509a0',1,'cv::cudev::max(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17935472e8616fd215d00f74958ff148',1,'cv::cudev::max(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5ac8be6bbe25ea472a8b035ca898d4',1,'cv::cudev::max(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cf8fa19265b62e66cabe413af3e98af',1,'cv::cudev::max(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga365449d2ee70ebad2e967ded65012d9f',1,'cv::cudev::max(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe20c764e1d3494e66d66bb79edd752b',1,'cv::cudev::max(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6908e25c314e9a522c4b81cd3b11b0e6',1,'cv::cudev::max(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabea3829667cf61d6d87ff887a0b62656',1,'cv::cudev::max(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f137995b4f2d9eb06126a5cfdd0b50',1,'cv::cudev::max(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga108f8c6df21015b48c0599f93404be91',1,'cv::cudev::max(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb469b3fb7117158fcfab61b99dd18fa',1,'cv::cudev::max(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0acbba9ca0c69f0393eb530b2f3086dc',1,'cv::cudev::max(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f53bfb32250efe690ddf916e22abc28',1,'cv::cudev::max(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74726357f2915b6368219138b4025fcc',1,'cv::cudev::max(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13b69add5d5f7e0a7b08d70c58628078',1,'cv::cudev::max(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea3eb5bf693497dea32ded82af090fdd',1,'cv::cudev::max(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae109b4e7ada4529f21451575bd6abeb7',1,'cv::cudev::max(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga590088e5ce5ec5e4ed714b4cce952e7f',1,'cv::cudev::max(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31b2a6f5dd43d410fd15868e6c0f280a',1,'cv::cudev::max(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99cb5e202087eaa0b229d3cf230728d1',1,'cv::cudev::max(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb8f76636a19b20fcb0210361532c2c',1,'cv::cudev::max(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095daa3a23199e024436979238b6bbd',1,'cv::cudev::max(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga813e1d83b09e82844b86d1353a77d748',1,'cv::cudev::max(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3cb3bca7308191b5700f530fa34ca',1,'cv::cudev::max(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d59e76ba65008f3b6b6b24b94d29ef',1,'cv::cudev::max(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3448076586183d18e39c7974dd70c8',1,'cv::cudev::max(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b97852d88c33eb05ee8831f2092012f',1,'cv::cudev::max(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12a59c2315768e81cd56da5cae21f33c',1,'cv::cudev::max(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c50fae74b2eaf9f75402c6f3f815b4',1,'cv::cudev::max(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e080dce49fa6b5ea358a2258bb629c6',1,'cv::cudev::max(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga024f510b15b88ba5c7424f3d491e75b7',1,'cv::cudev::max(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fc9392d7d60b78635d0c74636408fa6',1,'cv::cudev::max(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2097bf067a2cd8b1fb3ca5a314002c34',1,'cv::cudev::max(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21d3728ff2ae2aa507b6126bbdd1504a',1,'cv::cudev::max(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae35a8be3fd1df938eb2434db4ff5d6e1',1,'cv::cudev::max(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52c58c71c1b59d7072442a8bd2b47bce',1,'cv::cudev::max(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a9e142727b6a1dda24772209649785',1,'cv::cudev::max(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8f9e1e0e8752a30a78603922dc17e01',1,'cv::cudev::max(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga611a70849906e1ae3c0aa9e756cfb8de',1,'cv::cudev::max(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57333c18e7c065708d6ac3a6f68f6df3',1,'cv::cudev::max(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7da28fa160b61ce66315922672f10592',1,'cv::cudev::max(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7415c5b61082b4b9c7c2122f269a1e60',1,'cv::cudev::max(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga226f005c8e0685c696bc3b340f2913a3',1,'cv::cudev::max(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7e33b43b4a4e457011d464eb94a5d96',1,'cv::cudev::max(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8288851d3304269c3ff9ae788264de83',1,'cv::cudev::max(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea853b43ad12529c0afecebe3e75f33a',1,'cv::cudev::max(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa798788a3437d78a74ca1dc04e4b832e',1,'cv::cudev::max(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga984b7fb4be9bcb23c751e79824907172',1,'cv::cudev::max(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2ae1b02759bc502a2f9f0e1918fa61c',1,'cv::cudev::max(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09d4d1ecf2a01d8a04bfb6faed58ca75',1,'cv::cudev::max(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ffe50e3856a9c0ef216c9c2cc8ef88',1,'cv::cudev::max(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ef1167e26453336dfc63d860a92f2',1,'cv::cudev::max(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga054b13d0e5d1196e5c64aeafc35eda9d',1,'cv::cudev::max(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b7e9961d85c9275ca9797e2a7d492b',1,'cv::cudev::max(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cc953644000cdd73756355d21f65035',1,'cv::cudev::max(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga798df13ec7d9c0bfd7e87e9205fbe20e',1,'cv::cudev::max(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0d3731aadd1cd52d1497476d249c411',1,'cv::cudev::max(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12ed50409cb498ca954657e6d56e0aef',1,'cv::cudev::max(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03bdb4845489b77a0ec85e7db2116d8b',1,'cv::cudev::max(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b0eef253e07a5d3c8eb891aa0150ab4',1,'cv::cudev::max(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac81a538d91716632a351a3315bb27a',1,'cv::cudev::max(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a344c714483b3b153d094e38ab69ab',1,'cv::cudev::max(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc2afd9d000eb685e979e691c41efd8',1,'cv::cudev::max(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6417ca2883d855805c090de4b04a92cf',1,'cv::cudev::max(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ad7e5cdef23ce3709ab800afdab3a6',1,'cv::cudev::max(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae90057ec7319796e7dcfd7af28027386',1,'cv::cudev::max(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga057d8e2732db88e8f676b2f638127717',1,'cv::cudev::max(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cf8fba0ece505e1b05405af25c6de92',1,'cv::cudev::max(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga464718ee489ad5f8e1c9b575e510dec0',1,'cv::cudev::max(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c5c137d283d4daacfba1473b10b5541',1,'cv::cudev::max(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2082fcc1d0c81f321f78c10583f9e088',1,'cv::cudev::max(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0f9db015b2f6295ac50e0981442eccf',1,'cv::cudev::max(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d3a74e6af64be7dfeffbc8242c24c21',1,'cv::cudev::max(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfc39d6227d9b78470d511a20f948807',1,'cv::cudev::max(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d901c104487bf31776724581aac418a',1,'cv::cudev::max(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e805de45dbf65b56e332ac2b64bc8c8',1,'cv::cudev::max(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3642852f0e37cc6b223048baedb89b23',1,'cv::cudev::max(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8954cb6a927557a3afcbe7f53a47d0f',1,'cv::cudev::max(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f2ab33db68c0db0ea3490da34d41f6',1,'cv::cudev::max(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9b2181ee4a6be9ea8de2da75f821d4b',1,'cv::cudev::max(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8a6a48caa4e6ec56a6df3cbf6ee88ad',1,'cv::cudev::max(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4114f5fa4b6a1defced1ff6f09e99a77',1,'cv::cudev::max(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga709da4137ee804a37a3bf9897f81a54f',1,'cv::cudev::max(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga745f7c1a67b75924005059bdadfad059',1,'cv::cudev::max(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23cd6e3768da75d63ee2c772721547b5',1,'cv::cudev::max(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3535e57152bb9bb870cc80641924d968',1,'cv::cudev::max(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac75fd5ed788efc158eadfad05909768b',1,'cv::cudev::max(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bc01dd4cae5bc8f5d0fbbe41894e38c',1,'cv::cudev::max(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedb902f8f075950428f149f3ae6e8368',1,'cv::cudev::max(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42077dd2a8bbd9426871e1e6100bb88a',1,'cv::cudev::max(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c461a61928c807cfcbb35e05328a9f',1,'cv::cudev::max(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53b91c1178649b59ce12e5b7e3cd9f3b',1,'cv::cudev::max(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78ce5713c65e22a601075d719a9c78bc',1,'cv::cudev::max(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c69369e7994b7c797c2c7e251111d3',1,'cv::cudev::max(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf02f0270ebf0e09528142c25810f089e',1,'cv::cudev::max(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7cf77af63bb9be60fbe892722e899',1,'cv::cudev::max(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga016da0e12302e3a9a75ac629fd4711a6',1,'cv::cudev::max(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab90a61e27bbf62122d6d1630791f69e0',1,'cv::cudev::max(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0052ef1d3ba6d7a3b9ab72ca6527a9d0',1,'cv::cudev::max(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga833b26b174d46e6eb2983a845389f414',1,'cv::cudev::max(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f23d4191d045b10de43a72d2b9e2ab',1,'cv::cudev::max(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b690732c1fc4757ef340044ecfc4489',1,'cv::cudev::max(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe962f22e136477e81f50bfe84c27369',1,'cv::cudev::max(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ee23973c69d923d4dc293194ced992',1,'cv::cudev::max(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e1f15f8dd8f0672a29b786211703d3e',1,'cv::cudev::max(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9860c259c810cab9f11ca560b7ed50',1,'cv::cudev::max(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32870871b640f6b22406ec31171a7316',1,'cv::cudev::max(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad63be246086568453d852849a3323420',1,'cv::cudev::max(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20aac3e422e4cb8c3b7e5e70c1d14423',1,'cv::cudev::max(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc21c02538e0d716e033a0f60bd07ed7',1,'cv::cudev::max(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa8424d806478f3ec1226b9de554a54',1,'cv::cudev::max(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0427ef988e84eb62ff762dc5ece814c6',1,'cv::cudev::max(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc917089df0cae9685a241d7410d0d37',1,'cv::cudev::max(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed2f554315d00fe5e6787519fa821c7',1,'cv::cudev::max(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b345faefa99feef763db27ada3d285',1,'cv::cudev::max(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga602d4e347cb5bb2d3e0eacc8a185ab64',1,'cv::cudev::max(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a9f8491e0461da68dacc563649708c',1,'cv::cudev::max(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafb5251a655b274d9ad94130f58de64c',1,'cv::cudev::max(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab87360125776b39906941203e1b01988',1,'cv::cudev::max(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8116d6776ef06f4ce0decc7e25bb5471',1,'cv::cudev::max(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d496f6f0b4656db91a8ca8e6c533c9',1,'cv::cudev::max(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13bcfe8e2f5abff4acd6bb4b2f600d77',1,'cv::cudev::max(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga936cf9ff339de81e4c74b518a0356fed',1,'cv::cudev::max(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1a4045b1aba6742c364d17b98249ce6',1,'cv::cudev::max(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0149a2b69e6f49dc2138fbce981230b',1,'cv::cudev::max(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf93df076678da531781417d10b9cbbf',1,'cv::cudev::max(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db835d025ae8e27f82dc4c951e54bef',1,'cv::cudev::max(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9a1fdaaac965358a6f82c190302c6bf',1,'cv::cudev::max(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fbfaa00be80acd28eea2d9597ef58fc',1,'cv::cudev::max(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfbe7499b071b13a107e80a187b44e18',1,'cv::cudev::max(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79aa095d6cb5bcf6580bdf2766f33ab9',1,'cv::cudev::max(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf786b3d507ec79af09f1ff37fa58525',1,'cv::cudev::max(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga371a082668f40b2910437b066d610194',1,'cv::cudev::max(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3dda6876d0ddb4a6cc7a91c52d76c08',1,'cv::cudev::max(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7211b847fa77ba43a4274ddbc97ebd',1,'cv::cudev::max(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga620a0b36ae5d9f37970db813f4e8dad6',1,'cv::cudev::max(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7ddc4d5890f821cb280d7425ce5c74',1,'cv::cudev::max(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8f397fce7b658287fd0719a7197036',1,'cv::cudev::max(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81a2eeb9b0dc3148e6e93b297fe4e7e0',1,'cv::cudev::max(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga475f92091db274dbbb70a7706d0d0c40',1,'cv::cudev::max(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga859fcb1f96519a0148e0286f77a98569',1,'cv::cudev::max(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4e298eee324f7998e2f9ad32fdc362',1,'cv::cudev::max(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fa4a50a11b12e71a4b5971db09daed7',1,'cv::cudev::max(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29fd18d8e44839d3003b25e7c2be9f88',1,'cv::cudev::max(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga432a2fa36fadc150cd6a2b953e68362e',1,'cv::cudev::max(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a0a22941a27212e0a2ce3ced4b6ce23',1,'cv::cudev::max(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37c1b4a34f412f4f9a3b151f13a73db0',1,'cv::cudev::max(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86216fa87809ccfc51828718c5c42431',1,'cv::cudev::max(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3ab9e4e16dc195499a754530f4e7696',1,'cv::cudev::max(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3caf6dbeefcc40b730b67f8a21584d47',1,'cv::cudev::max(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65ff60ad91763997812d3721ff9b4ce9',1,'cv::cudev::max(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0cd4e99dd1837208bb030e4de8239ba',1,'cv::cudev::max(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec0cfaea38a71f6439a84dd49181e73d',1,'cv::cudev::max(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73baf05ed230e047e8b1a4a2cc883168',1,'cv::cudev::max(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6e726e28a344d15ba4f74e9b3a624bf',1,'cv::cudev::max(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39231493f16b86d7850dde970bfc35de',1,'cv::cudev::max(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6c1b774c5b7a8e2dfd6f4ebb46329ab',1,'cv::cudev::max(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628a75ac09a15e078f60b2ff10091794',1,'cv::cudev::max(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8833c4e522d0818abcfbaed896c9830',1,'cv::cudev::max(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7feb89effc24d3e37cd28dbe3e7b645',1,'cv::cudev::max(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga727b7d3d95fff67e0a602255e3b31f1f',1,'cv::cudev::max(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga097408aee5dc871470963d6f0a1ff929',1,'cv::cudev::max(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e3c84204b34ce3d42a85a20fe00a57c',1,'cv::cudev::max(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e0f041f44d4dfe49cfd4b47a3f82377',1,'cv::cudev::max(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaac935d91a102285989be110a5acfeb',1,'cv::cudev::max(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9ab71229973969fae54bd11d59236e6',1,'cv::cudev::max(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad143763f595cbe3d51d5d0e024939f4c',1,'cv::cudev::max(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac468f9c2a30559c3c66a33fa44eb0618',1,'cv::cudev::max(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga0ff081ea80eb39a96389c16ac0f9e944',1,'cv::gapi::max()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gacc40fa15eac0fb83f8ca70b7cc0b588d',1,'max(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad81c37ed0b0fd23ede0cefadbf04af44',1,'max(const Mat &src1, const Mat &src2, Mat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6eefd595055bf1ea4ba3d12f70531511',1,'max(const UMat &src1, const UMat &src2, UMat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6361d683afa3e472e06a0c2e80984f00',1,'max()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga78f988f6cfa6223610298cbd4f86ec66',1,'max(const softfloat &a, const softfloat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga07f4a159313983528c74d5162a56fbc9',1,'max(const softdouble &a, const softdouble &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga0ff081ea80eb39a96389c16ac0f9e944',1,'max(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gadb5dd3d870f10c0866035755b929b1e7',1,'max(InputArray src1, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7edae1e0cfcb34a59e251c9b330949',1,'max(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff9681cddad025c92c98529215adacb',1,'max(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6432d74919e90dbda4727df485d68878',1,'max(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae250eaed4ac6113528a0590afe45b099',1,'max(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bd06dc616da56d71d6f238772e921e',1,'max(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd2a8c631c77af12548b22aaacebc87a',1,'max(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf5c19898fc50d657385caeca1ca1ede',1,'max(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3763f4140dbd3501a732882e48c5102c',1,'max(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8946999942e013d38872e231417093a0',1,'max(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db3b60a0cbe9bc77ad3e698954a9c18',1,'max(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga634efcb854017039414da832695a2533',1,'max(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4adf20946d2403cdc84854e778d03a9a',1,'max(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9c563261c87743c5dab045a91a61c7c',1,'max(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae17404884a5f0ef7eaf56225fb604fe6',1,'max(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ce2d615591426d5adb4764996698b9',1,'max(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bf33fe22d6e7efb9e5faacbba1c6a45',1,'max(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf91add376317b3731608216f28ab963',1,'max(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0053e35915c820454ea2264d4ee7613f',1,'max(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62698a80e29b75ec8505358a3799936e',1,'max(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bce6ab7cccef843a7c944bbdbf63b07',1,'max(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b384425584ac7c2d34bdc057e5af65',1,'max(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d199235971dff02dc2959f563d23308',1,'max(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga327485d656538e5fa100c599c75a1e00',1,'max(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a96f99c184fabb74382774232aa3a34',1,'max(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1015f0bfdd3bb605e0e9d1fd147e1df4',1,'max(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bd5ed74854a11a09051de2954f15ed5',1,'max(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e265a5d6affec6d1afbd2ef5f14e06',1,'max(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa886e0915a0f68093092573066797ad',1,'max(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49797f16c920f5d36c3174510dec72ea',1,'max(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70201802b3cf2254a774fcd6a556772c',1,'max(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6460dd389b726df9bb0a7bcfbdc759de',1,'max(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76dd5f19b86e2c63bbd784ce53d8c3d5',1,'max(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20343d119b1183a8e2c86859ebf509a0',1,'max(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17935472e8616fd215d00f74958ff148',1,'max(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5ac8be6bbe25ea472a8b035ca898d4',1,'max(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cf8fa19265b62e66cabe413af3e98af',1,'max(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga365449d2ee70ebad2e967ded65012d9f',1,'max(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe20c764e1d3494e66d66bb79edd752b',1,'max(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6908e25c314e9a522c4b81cd3b11b0e6',1,'max(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabea3829667cf61d6d87ff887a0b62656',1,'max(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f137995b4f2d9eb06126a5cfdd0b50',1,'max(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga108f8c6df21015b48c0599f93404be91',1,'max(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb469b3fb7117158fcfab61b99dd18fa',1,'max(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0acbba9ca0c69f0393eb530b2f3086dc',1,'max(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f53bfb32250efe690ddf916e22abc28',1,'max(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74726357f2915b6368219138b4025fcc',1,'max(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13b69add5d5f7e0a7b08d70c58628078',1,'max(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea3eb5bf693497dea32ded82af090fdd',1,'max(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae109b4e7ada4529f21451575bd6abeb7',1,'max(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga590088e5ce5ec5e4ed714b4cce952e7f',1,'max(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31b2a6f5dd43d410fd15868e6c0f280a',1,'max(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99cb5e202087eaa0b229d3cf230728d1',1,'max(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb8f76636a19b20fcb0210361532c2c',1,'max(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095daa3a23199e024436979238b6bbd',1,'max(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga813e1d83b09e82844b86d1353a77d748',1,'max(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3cb3bca7308191b5700f530fa34ca',1,'max(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d59e76ba65008f3b6b6b24b94d29ef',1,'max(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3448076586183d18e39c7974dd70c8',1,'max(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b97852d88c33eb05ee8831f2092012f',1,'max(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12a59c2315768e81cd56da5cae21f33c',1,'max(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c50fae74b2eaf9f75402c6f3f815b4',1,'max(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e080dce49fa6b5ea358a2258bb629c6',1,'max(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga024f510b15b88ba5c7424f3d491e75b7',1,'max(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fc9392d7d60b78635d0c74636408fa6',1,'max(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2097bf067a2cd8b1fb3ca5a314002c34',1,'max(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21d3728ff2ae2aa507b6126bbdd1504a',1,'max(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae35a8be3fd1df938eb2434db4ff5d6e1',1,'max(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52c58c71c1b59d7072442a8bd2b47bce',1,'max(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a9e142727b6a1dda24772209649785',1,'max(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8f9e1e0e8752a30a78603922dc17e01',1,'max(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga611a70849906e1ae3c0aa9e756cfb8de',1,'max(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57333c18e7c065708d6ac3a6f68f6df3',1,'max(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7da28fa160b61ce66315922672f10592',1,'max(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7415c5b61082b4b9c7c2122f269a1e60',1,'max(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga226f005c8e0685c696bc3b340f2913a3',1,'max(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7e33b43b4a4e457011d464eb94a5d96',1,'max(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8288851d3304269c3ff9ae788264de83',1,'max(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea853b43ad12529c0afecebe3e75f33a',1,'max(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa798788a3437d78a74ca1dc04e4b832e',1,'max(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga984b7fb4be9bcb23c751e79824907172',1,'max(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2ae1b02759bc502a2f9f0e1918fa61c',1,'max(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09d4d1ecf2a01d8a04bfb6faed58ca75',1,'max(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ffe50e3856a9c0ef216c9c2cc8ef88',1,'max(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ef1167e26453336dfc63d860a92f2',1,'max(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga054b13d0e5d1196e5c64aeafc35eda9d',1,'max(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b7e9961d85c9275ca9797e2a7d492b',1,'max(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cc953644000cdd73756355d21f65035',1,'max(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga798df13ec7d9c0bfd7e87e9205fbe20e',1,'max(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0d3731aadd1cd52d1497476d249c411',1,'max(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12ed50409cb498ca954657e6d56e0aef',1,'max(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03bdb4845489b77a0ec85e7db2116d8b',1,'max(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b0eef253e07a5d3c8eb891aa0150ab4',1,'max(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac81a538d91716632a351a3315bb27a',1,'max(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a344c714483b3b153d094e38ab69ab',1,'max(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc2afd9d000eb685e979e691c41efd8',1,'max(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6417ca2883d855805c090de4b04a92cf',1,'max(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ad7e5cdef23ce3709ab800afdab3a6',1,'max(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae90057ec7319796e7dcfd7af28027386',1,'max(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga057d8e2732db88e8f676b2f638127717',1,'max(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cf8fba0ece505e1b05405af25c6de92',1,'max(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga464718ee489ad5f8e1c9b575e510dec0',1,'max(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c5c137d283d4daacfba1473b10b5541',1,'max(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2082fcc1d0c81f321f78c10583f9e088',1,'max(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0f9db015b2f6295ac50e0981442eccf',1,'max(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d3a74e6af64be7dfeffbc8242c24c21',1,'max(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfc39d6227d9b78470d511a20f948807',1,'max(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d901c104487bf31776724581aac418a',1,'max(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e805de45dbf65b56e332ac2b64bc8c8',1,'max(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3642852f0e37cc6b223048baedb89b23',1,'max(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8954cb6a927557a3afcbe7f53a47d0f',1,'max(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f2ab33db68c0db0ea3490da34d41f6',1,'max(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9b2181ee4a6be9ea8de2da75f821d4b',1,'max(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8a6a48caa4e6ec56a6df3cbf6ee88ad',1,'max(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4114f5fa4b6a1defced1ff6f09e99a77',1,'max(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga709da4137ee804a37a3bf9897f81a54f',1,'max(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga745f7c1a67b75924005059bdadfad059',1,'max(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23cd6e3768da75d63ee2c772721547b5',1,'max(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3535e57152bb9bb870cc80641924d968',1,'max(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac75fd5ed788efc158eadfad05909768b',1,'max(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bc01dd4cae5bc8f5d0fbbe41894e38c',1,'max(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedb902f8f075950428f149f3ae6e8368',1,'max(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42077dd2a8bbd9426871e1e6100bb88a',1,'max(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c461a61928c807cfcbb35e05328a9f',1,'max(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53b91c1178649b59ce12e5b7e3cd9f3b',1,'max(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78ce5713c65e22a601075d719a9c78bc',1,'max(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c69369e7994b7c797c2c7e251111d3',1,'max(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf02f0270ebf0e09528142c25810f089e',1,'max(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7cf77af63bb9be60fbe892722e899',1,'max(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga016da0e12302e3a9a75ac629fd4711a6',1,'max(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab90a61e27bbf62122d6d1630791f69e0',1,'max(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0052ef1d3ba6d7a3b9ab72ca6527a9d0',1,'max(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga833b26b174d46e6eb2983a845389f414',1,'max(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f23d4191d045b10de43a72d2b9e2ab',1,'max(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b690732c1fc4757ef340044ecfc4489',1,'max(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe962f22e136477e81f50bfe84c27369',1,'max(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ee23973c69d923d4dc293194ced992',1,'max(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e1f15f8dd8f0672a29b786211703d3e',1,'max(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9860c259c810cab9f11ca560b7ed50',1,'max(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32870871b640f6b22406ec31171a7316',1,'max(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad63be246086568453d852849a3323420',1,'max(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20aac3e422e4cb8c3b7e5e70c1d14423',1,'max(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc21c02538e0d716e033a0f60bd07ed7',1,'max(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa8424d806478f3ec1226b9de554a54',1,'max(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0427ef988e84eb62ff762dc5ece814c6',1,'max(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc917089df0cae9685a241d7410d0d37',1,'max(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed2f554315d00fe5e6787519fa821c7',1,'max(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b345faefa99feef763db27ada3d285',1,'max(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga602d4e347cb5bb2d3e0eacc8a185ab64',1,'max(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a9f8491e0461da68dacc563649708c',1,'max(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafb5251a655b274d9ad94130f58de64c',1,'max(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab87360125776b39906941203e1b01988',1,'max(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8116d6776ef06f4ce0decc7e25bb5471',1,'max(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d496f6f0b4656db91a8ca8e6c533c9',1,'max(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13bcfe8e2f5abff4acd6bb4b2f600d77',1,'max(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga936cf9ff339de81e4c74b518a0356fed',1,'max(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1a4045b1aba6742c364d17b98249ce6',1,'max(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0149a2b69e6f49dc2138fbce981230b',1,'max(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf93df076678da531781417d10b9cbbf',1,'max(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db835d025ae8e27f82dc4c951e54bef',1,'max(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9a1fdaaac965358a6f82c190302c6bf',1,'max(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fbfaa00be80acd28eea2d9597ef58fc',1,'max(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfbe7499b071b13a107e80a187b44e18',1,'max(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79aa095d6cb5bcf6580bdf2766f33ab9',1,'max(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf786b3d507ec79af09f1ff37fa58525',1,'max(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga371a082668f40b2910437b066d610194',1,'max(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3dda6876d0ddb4a6cc7a91c52d76c08',1,'max(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7211b847fa77ba43a4274ddbc97ebd',1,'max(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga620a0b36ae5d9f37970db813f4e8dad6',1,'max(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7ddc4d5890f821cb280d7425ce5c74',1,'max(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8f397fce7b658287fd0719a7197036',1,'max(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81a2eeb9b0dc3148e6e93b297fe4e7e0',1,'max(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga475f92091db274dbbb70a7706d0d0c40',1,'max(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga859fcb1f96519a0148e0286f77a98569',1,'max(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4e298eee324f7998e2f9ad32fdc362',1,'max(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fa4a50a11b12e71a4b5971db09daed7',1,'max(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29fd18d8e44839d3003b25e7c2be9f88',1,'max(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga432a2fa36fadc150cd6a2b953e68362e',1,'max(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a0a22941a27212e0a2ce3ced4b6ce23',1,'max(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37c1b4a34f412f4f9a3b151f13a73db0',1,'max(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86216fa87809ccfc51828718c5c42431',1,'max(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3ab9e4e16dc195499a754530f4e7696',1,'max(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3caf6dbeefcc40b730b67f8a21584d47',1,'max(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65ff60ad91763997812d3721ff9b4ce9',1,'max(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0cd4e99dd1837208bb030e4de8239ba',1,'max(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec0cfaea38a71f6439a84dd49181e73d',1,'max(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73baf05ed230e047e8b1a4a2cc883168',1,'max(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6e726e28a344d15ba4f74e9b3a624bf',1,'max(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39231493f16b86d7850dde970bfc35de',1,'max(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6c1b774c5b7a8e2dfd6f4ebb46329ab',1,'max(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628a75ac09a15e078f60b2ff10091794',1,'max(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8833c4e522d0818abcfbaed896c9830',1,'max(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7feb89effc24d3e37cd28dbe3e7b645',1,'max(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga727b7d3d95fff67e0a602255e3b31f1f',1,'max(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga097408aee5dc871470963d6f0a1ff929',1,'max(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e3c84204b34ce3d42a85a20fe00a57c',1,'max(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e0f041f44d4dfe49cfd4b47a3f82377',1,'max(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaac935d91a102285989be110a5acfeb',1,'max(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9ab71229973969fae54bd11d59236e6',1,'max(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad143763f595cbe3d51d5d0e024939f4c',1,'max(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac468f9c2a30559c3c66a33fa44eb0618',1,'max(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#aa05dc1fa1f8a513888fd311ea7b39aa3',1,'__gnu_parallel::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga84d30d8c4b3f2cbe8ec2055c34a578da',1,'std::max(const _Tp &__a, const _Tp &__b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga2a22232a7bcd3b1f87a45a5fb01ac9c3',1,'std::max(const _Tp &__a, const _Tp &__b, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4e66ea69757ab2d6193e385c919e6f71',1,'max() const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga84d30d8c4b3f2cbe8ec2055c34a578da',1,'max(const _Tp &__a, const _Tp &__b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga2a22232a7bcd3b1f87a45a5fb01ac9c3',1,'max(const _Tp &__a, const _Tp &__b, _Compare __comp)(Global Namespace)']]], + ['max16s_542',['max16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66336453cd904ddef80b325b92626610',1,'cv::hal::max16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66336453cd904ddef80b325b92626610',1,'max16s()(Global Namespace)']]], + ['max16u_543',['max16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga601826ce6352e8b85eb260be8b85c7a6',1,'cv::hal::max16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga601826ce6352e8b85eb260be8b85c7a6',1,'max16u()(Global Namespace)']]], + ['max32f_544',['max32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga4652f0687a917b049d22a466adb4c18e',1,'cv::hal::max32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga4652f0687a917b049d22a466adb4c18e',1,'max32f()(Global Namespace)']]], + ['max32s_545',['max32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6738c923e01c515b9c3be8329adf5494',1,'cv::hal::max32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6738c923e01c515b9c3be8329adf5494',1,'max32s()(Global Namespace)']]], + ['max64f_546',['max64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9283f7d52b658ea4c9b59652d9f0a173',1,'cv::hal::max64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9283f7d52b658ea4c9b59652d9f0a173',1,'max64f()(Global Namespace)']]], + ['max8s_547',['max8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacc4819891df74719567179051e911e2b',1,'cv::hal::max8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacc4819891df74719567179051e911e2b',1,'max8s()(Global Namespace)']]], + ['max8u_548',['max8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac92f2f18733b6f8ac7692da669252906',1,'cv::hal::max8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac92f2f18733b6f8ac7692da669252906',1,'max8u()(Global Namespace)']]], + ['max_5f_549',['max_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41470dd8d5f61c2020ab8672a483838',1,'cv::cudev::max_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41470dd8d5f61c2020ab8672a483838',1,'max_()(Global Namespace)']]], + ['max_5fbucket_5fcount_550',['max_bucket_count',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af29f5a18a09a36adb720b6907e45eacd',1,'std::unordered_map::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a193e48c36ac0f5888911cf991428a287',1,'std::unordered_multimap::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#abc4c192168d4217376439dce87cf12a2',1,'std::unordered_multiset::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#afc90e16afa79bd929b49590dc8637b00',1,'std::unordered_set::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af29f5a18a09a36adb720b6907e45eacd',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_bucket_count()']]], + ['max_5fcount_551',['max_count',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#aa038f38231a225b4eae4b7a641cae9d0a7c66d09f76b308caa4430f2f04575835',1,'__gnu_pbds::lu_counter_policy']]], + ['max_5fdigits10_552',['max_digits10',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a1c62958a09eb69aba2a03a6e03b1574f',1,'std::__numeric_limits_base::max_digits10'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a1c62958a09eb69aba2a03a6e03b1574f',1,'std::numeric_limits::max_digits10']]], + ['max_5fdim_553',['MAX_DIM',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a56b3ce308d0a3e4929a96c65ff4d9914abe1aff4cd2b540afd5a3f4ffca3bd9a2',1,'cv::SparseMat']]], + ['max_5felement_554',['max_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6c310c6d1db64624d3097dd06838ef9b',1,'std::max_element(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gab0bc7a1a77eead2e4af61c6506230104',1,'std::max_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6c310c6d1db64624d3097dd06838ef9b',1,'max_element(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gab0bc7a1a77eead2e4af61c6506230104',1,'max_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], + ['max_5felement_5fminimal_5fn_555',['max_element_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ad032e9ab491119f763bfb79cbfcc24d8',1,'__gnu_parallel::_Settings']]], + ['max_5fexponent_556',['max_exponent',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ac68694be9c73ac6e36c3fe2ab1f18da4',1,'std::__numeric_limits_base::max_exponent'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ac68694be9c73ac6e36c3fe2ab1f18da4',1,'std::numeric_limits::max_exponent']]], + ['max_5fexponent10_557',['max_exponent10',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#afa984ea44c90b032e00779a960af64ff',1,'std::__numeric_limits_base::max_exponent10'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#afa984ea44c90b032e00779a960af64ff',1,'std::numeric_limits::max_exponent10']]], + ['max_5fiter_558',['MAX_ITER',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57a56ca2bc5cd06345060a1c1c66a8fc06e',1,'cv::TermCriteria']]], + ['max_5fload_5ffactor_559',['max_load_factor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae2f58d908f2e03656fce158550d9ba73',1,'std::unordered_map::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0584274b6378b6d962debbe96f5c5cb6',1,'std::unordered_map::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a72250fbcb87cc6ea4998eb8f00465650',1,'std::unordered_multimap::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#afea08a0d2315df4b6da1318c74be7114',1,'std::unordered_multimap::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a1d6af6a14a53c2709b072d6722ecf039',1,'std::unordered_multiset::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aff0cd0917d69025d995dd401c1ec63a6',1,'std::unordered_multiset::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ac182f2597af135950bfc3b1cd09575ec',1,'std::unordered_set::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a086929d624211470ff2b20a0ba23a86d',1,'std::unordered_set::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae2f58d908f2e03656fce158550d9ba73',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0584274b6378b6d962debbe96f5c5cb6',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_load_factor(float __z)']]], + ['max_5fm_560',['max_m',['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#ac6b386734baae252e9fbce2431315851',1,'cv::face::FacemarkAAM::Params::max_m'],['https://docs.opencv.org/4.2.0/db/d26/structcv_1_1face_1_1FacemarkAAM_1_1Model_1_1Texture.html#afc5d72e6384a0cb5f2182e8bd45e2c47',1,'cv::face::FacemarkAAM::Model::Texture::max_m']]], + ['max_5fn_561',['max_n',['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#ad28c713c2827875b85a7cb970cba2eed',1,'cv::face::FacemarkAAM::Params']]], + ['max_5fnum_5fobjects_5fin_5ftrack_562',['max_num_objects_in_track',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#acae65ec599c1fd89983b0438ea41ef90',1,'cv::tbm::TrackerParams']]], + ['max_5fpatch_5fsize_563',['max_patch_size',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#ad9f3a7e89e57ebc3243ea925b432a4e5',1,'cv::TrackerKCF::Params']]], + ['max_5fpixel_5fvalue_5fdefault_564',['MAX_PIXEL_VALUE_DEFAULT',['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#a54c4173ba0261974b97d60d0b697e2b3',1,'cv::quality::QualityPSNR']]], + ['max_5fprobability_5fancestor_565',['max_probability_ancestor',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a3fbe891fbba61bdb6a07e062c72510bd',1,'cv::text::ERStat']]], + ['max_5fsize_566',['max_size',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a5fdf0b0b785ed6eb4868aa5d587ead96',1,'cv::Allocator::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a29c306bcb6a7676a516430a0e50b990a',1,'__alloc_traits< _Tp_alloc_type >::max_size(const _Tp_alloc_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'__alloc_traits< _Tp_alloc_type >::max_size(const _Tp_alloc_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a29c306bcb6a7676a516430a0e50b990a',1,'__gnu_cxx::__alloc_traits::max_size(const _Alloc &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'__gnu_cxx::__alloc_traits::max_size(const _Alloc &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac8315ed08ac178584cf4a80ff4f7346a',1,'__gnu_cxx::__versa_string::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'__gnu_debug::basic_string::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'allocator_traits< _Tp_alloc_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< _CharT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< _CharT, _Traits, _Allocator >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< char >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< char, char_traits< char >, _Byte_alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< char_type, _Traits, _Alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< value_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5aea8252ed76805923d591f878768f67',1,'deque< _StateSeqT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac0642b1d26b07dcf28d5fd72bfbdd6d1',1,'list< __inp, __rebind_inp >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a586a8264c3ff903b6a2d66b245c3f88e',1,'match_results< _Bi_iter >::max_size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a586a8264c3ff903b6a2d66b245c3f88e',1,'match_results< _Bi_iter >::max_size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'std::allocator_traits::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a7d06983d84598768a8aa6458ac10738c',1,'std::allocator_traits< allocator< _Tp > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'std::basic_string::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5aea8252ed76805923d591f878768f67',1,'std::deque::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ae19c74808b1bc8e53bdc229fd3d389fa',1,'std::forward_list::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac0642b1d26b07dcf28d5fd72bfbdd6d1',1,'std::list::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#af2c022c3b246d7beb4c6eae4d6ce7ca2',1,'std::map::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a586a8264c3ff903b6a2d66b245c3f88e',1,'std::match_results::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a6c9a48e59ffb98b5afe9003861f1ddee',1,'std::multimap::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aec68936b69a9391df7ea268a7c44fb13',1,'std::multiset::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a84c5ddf1dff1dbdb8583cfabe3605b86',1,'std::set::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a70757335be624593a6bdf3c84d4895ee',1,'std::tr2::dynamic_bitset::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a695e48bcb2fa9e91ad07d3f7c45016dd',1,'std::unordered_map::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#accd0a24f61c8161dbd0fe216ead19142',1,'std::unordered_multimap::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af0cbbd14540e7875dd507533a959bf77',1,'std::unordered_multiset::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#afbad50ec9cd24208c2b33f35aa50f371',1,'std::unordered_set::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'std::vector::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a695e48bcb2fa9e91ad07d3f7c45016dd',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< __diff_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _CharClassT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _CharT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _Cmpt >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _Node *, _Nodeptr_Alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _RealType >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _State< _TraitsT::char_type > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _StringT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< block_type, allocator_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< Catalog_info * >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< double >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< int >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< result_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< size_t >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< std::pair< _BiIter, int > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< std::pair< _StateIdT, std::vector > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< std::pair< _StrTransT, _StrTransT > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< sub_match< _Bi_iter >, _Alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< sub_match< _BiIter >, _Alloc >::max_size()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a1b46c6631e30b8394e89bd1546d69736.html#a1b46c6631e30b8394e89bd1546d69736',1,'nlohmann::basic_json::max_size()']]], + ['maxarea_567',['maxArea',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a4fefafbf9b8d647f43c1e844d6c174d6',1,'cv::SimpleBlobDetector::Params']]], + ['maxcatcount_568',['maxCatCount',['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#a9460db994628b36f047b6365f37b07a1',1,'cv::CvFeatureParams']]], + ['maxcircularity_569',['maxCircularity',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a019186a4c99547810f0130802467b746',1,'cv::SimpleBlobDetector::Params']]], + ['maxclockfrequency_570',['maxClockFrequency',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2ad4a9905df7939ff4dbe1e1323155ef',1,'cv::ocl::Device']]], + ['maxcmlength_571',['maxCMLength',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a6ea07155a65e042b22f98fb0b1185fac',1,'cv::TrackerModel']]], + ['maxcoeff_572',['maxCoeff',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'Eigen::DenseBase::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'Eigen::DenseBase::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'Eigen::DenseBase::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'DenseBase< ArrayWrapper< ExpressionType > >::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'DenseBase< ArrayWrapper< ExpressionType > >::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'DenseBase< ArrayWrapper< ExpressionType > >::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'DenseBase< Solve< Decomposition, RhsType > >::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'DenseBase< Solve< Decomposition, RhsType > >::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'DenseBase< Solve< Decomposition, RhsType > >::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'Eigen::VectorwiseOp::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Derived, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Derived, Vertical >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::maxCoeff()']]], + ['maxcolsatcompiletime_573',['MaxColsAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dacc3a41000cf1d29dd1a320b2a09d2a65',1,'Eigen::DenseBase::MaxColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dacc3a41000cf1d29dd1a320b2a09d2a65',1,'DenseBase< ArrayWrapper< ExpressionType > >::MaxColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dacc3a41000cf1d29dd1a320b2a09d2a65',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::MaxColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dacc3a41000cf1d29dd1a320b2a09d2a65',1,'DenseBase< Solve< Decomposition, RhsType > >::MaxColsAtCompileTime']]], + ['maxcomputeunits_574',['maxComputeUnits',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a8cdbedf915935b8a3de00abcf0ff9669',1,'cv::ocl::Device']]], + ['maxconstantargs_575',['maxConstantArgs',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a1ab0e68f5c0ab2daa578f0b408f71353',1,'cv::ocl::Device']]], + ['maxconstantbuffersize_576',['maxConstantBufferSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#aa5ce4c19f0b23e5cad7ad9e55aef2e0c',1,'cv::ocl::Device']]], + ['maxconvexity_577',['maxConvexity',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#add498d1d21fee200964bb6682c29303e',1,'cv::SimpleBlobDetector::Params']]], + ['maxcorrectionbits_578',['maxCorrectionBits',['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a729196b33a1a678a82f01f8e15d7864b',1,'cv::aruco::Dictionary']]], + ['maxcount_579',['maxCount',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a35d5f474a78725a9b2a54c1c357b7a35',1,'cv::TermCriteria']]], + ['maxdepth_580',['maxDepth',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#aeb5d02172f4cb8089a71a860a6f7709f',1,'cv::rgbd::ICPOdometry::maxDepth'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a065b90e87ca51a0a20fc225539fd9504',1,'cv::rgbd::RgbdICPOdometry::maxDepth'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#ab13d0a93d6e4d510c43404fb143a370a',1,'cv::rgbd::RgbdOdometry::maxDepth']]], + ['maxdepthdiff_581',['maxDepthDiff',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#aecd843efaf58de7f7ae73db7f47247e7',1,'cv::rgbd::ICPOdometry::maxDepthDiff'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a45d9e421c99ae52ed99dbb2ed16fe7ca',1,'cv::rgbd::RgbdICPOdometry::maxDepthDiff'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a35953e9658b01038c6c99886f22d80d2',1,'cv::rgbd::RgbdOdometry::maxDepthDiff']]], + ['maxdistdiff_582',['maxDistDiff',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a4f118f933d22e17ddd5a8f9de6b1816a',1,'cv::rgbd::FastICPOdometry']]], + ['maxerroneousbitsinborderrate_583',['maxErroneousBitsInBorderRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a9d1e50a0e344152d6507e4b276abc281',1,'cv::aruco::DetectorParameters']]], + ['maxgridsize_584',['maxGridSize',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a0a1d357f595900f4ecdac350db7d672c',1,'cv::cuda::DeviceInfo']]], + ['maximum_585',['maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'Element-wise minimum or maximum'],['https://docs.opencv.org/4.2.0/d4/d31/structcv_1_1cudev_1_1maximum.html',1,'cv::cudev::maximum< class >']]], + ['maximum_3c_20double_20_3e_586',['maximum< double >',['https://docs.opencv.org/4.2.0/dc/d65/structcv_1_1cudev_1_1maximum_3_01double_01_4.html',1,'cv::cudev']]], + ['maximum_3c_20float_20_3e_587',['maximum< float >',['https://docs.opencv.org/4.2.0/d4/d1e/structcv_1_1cudev_1_1maximum_3_01float_01_4.html',1,'cv::cudev']]], + ['maximum_3c_20schar_20_3e_588',['maximum< schar >',['https://docs.opencv.org/4.2.0/df/df2/structcv_1_1cudev_1_1maximum_3_01schar_01_4.html',1,'cv::cudev']]], + ['maximum_3c_20short_20_3e_589',['maximum< short >',['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1maximum_3_01short_01_4.html',1,'cv::cudev']]], + ['maximum_3c_20uchar_20_3e_590',['maximum< uchar >',['https://docs.opencv.org/4.2.0/dc/d84/structcv_1_1cudev_1_1maximum_3_01uchar_01_4.html',1,'cv::cudev']]], + ['maximum_3c_20uint_20_3e_591',['maximum< uint >',['https://docs.opencv.org/4.2.0/d8/dfa/structcv_1_1cudev_1_1maximum_3_01uint_01_4.html',1,'cv::cudev']]], + ['maximum_3c_20ushort_20_3e_592',['maximum< ushort >',['https://docs.opencv.org/4.2.0/d0/dac/structcv_1_1cudev_1_1maximum_3_01ushort_01_4.html',1,'cv::cudev']]], + ['maxinertiaratio_593',['maxInertiaRatio',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#ac19c44f1166147eb321247984787f9d2',1,'cv::SimpleBlobDetector::Params']]], + ['maxiteration_594',['maxIteration',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#aa6a85c5e76ad2c398cf4dfb62a77ac68',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['maxiterations_595',['maxIterations',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a168a74c8dceb6233b220031fdd756ba0',1,'Eigen::IterativeSolverBase']]], + ['maxlevel_596',['maxLevel',['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#affd8a2aac0fd498ab04f587811acec6c',1,'cv::TrackerMedianFlow::Params::maxLevel'],['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a6eca27e3da61c48502db0299e852dd1d',1,'cv::optflow::RLOFOpticalFlowParameter::maxLevel'],['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html#aa1e49ada8bd3ff9eb22811a48ca3dc90',1,'cv::videostab::PyrLkOptFlowEstimatorBase::maxLevel() const']]], + ['maxlevel_5f_597',['maxLevel_',['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html#afbfdccf15125e25764a7366b1c2562ef',1,'cv::videostab::PyrLkOptFlowEstimatorBase']]], + ['maxmarkerperimeterrate_598',['maxMarkerPerimeterRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#aa5d26f7b2428a6b9499e33b007c66d5b',1,'cv::aruco::DetectorParameters']]], + ['maxmedianlengthofdisplacementdifference_599',['maxMedianLengthOfDisplacementDifference',['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#a61d27a22d05cde55d2d8a3d20be0ba49',1,'cv::TrackerMedianFlow::Params']]], + ['maxmemallocsize_600',['maxMemAllocSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a43a7ce355911b326d286ecaab3fb2e30',1,'cv::ocl::Device']]], + ['maxobjsize_601',['maxObjSize',['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#a36207faebbad7ce45c3dde9d37c9e5f4',1,'cv::DetectionBasedTracker::IDetector']]], + ['maxparametersize_602',['maxParameterSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0878eb6f7c3b8d9043e46d73a00137f3',1,'cv::ocl::Device']]], + ['maxpivot_603',['maxPivot',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aac8c43d720170980f582d01494df9e8f',1,'Eigen::ColPivHouseholderQR::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aac8c43d720170980f582d01494df9e8f',1,'ColPivHouseholderQR< MatrixType >::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a5b712a58c13b7e5089be9228ec42f738',1,'Eigen::CompleteOrthogonalDecomposition::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a7887506237a3bf912aebc9aaa8edacec',1,'Eigen::FullPivHouseholderQR::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#abced9f280f5fc49c2e62605c782b237b',1,'Eigen::FullPivLU::maxPivot()']]], + ['maxpointspart_604',['maxPointsPart',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a949f055f8ebc29ddf5a2c8d35b8552fc',1,'cv::rgbd::ICPOdometry::maxPointsPart'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a76b55cb57ba18a605c3da5927622f10e',1,'cv::rgbd::RgbdICPOdometry::maxPointsPart'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a0eb5274fa0f3abb2d105fa545e5d399b',1,'cv::rgbd::RgbdOdometry::maxPointsPart']]], + ['maxposbuffer_605',['maxPosBuffer',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a125bb5a98ca8d63f5d0ed5fac895b8af',1,'cv::cuda::SURF_CUDA']]], + ['maxreadimageargs_606',['maxReadImageArgs',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a5b3698f3adbd38f41531799ae54e1826',1,'cv::ocl::Device']]], + ['maxrectifieddistance_607',['maxRectifiedDistance',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a752a0bea3ac5fb2ab1ad695a13274199',1,'cv::CirclesGridFinderParameters']]], + ['maxrotation_608',['maxRotation',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#af845083029333e0684ef03e33eed2208',1,'cv::rgbd::ICPOdometry::maxRotation'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a8a27d345552b282b5de085320b8b2469',1,'cv::rgbd::RgbdICPOdometry::maxRotation'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a586a324c1d6c59f75b72f4dff6cc22b8',1,'cv::rgbd::RgbdOdometry::maxRotation']]], + ['maxrowsatcompiletime_609',['MaxRowsAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dad2baadea085372837b0e80dc93be1306',1,'Eigen::DenseBase::MaxRowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dad2baadea085372837b0e80dc93be1306',1,'DenseBase< ArrayWrapper< ExpressionType > >::MaxRowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dad2baadea085372837b0e80dc93be1306',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::MaxRowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dad2baadea085372837b0e80dc93be1306',1,'DenseBase< Solve< Decomposition, RhsType > >::MaxRowsAtCompileTime']]], + ['maxsamplers_610',['maxSamplers',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a88f1375b142fbed9b3fcf69ffd70289c',1,'cv::ocl::Device']]], + ['maxsize_611',['maxSize',['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html#aca4652bfbf2c3ea15a2c60828790e097',1,'cv::face::CParams::maxSize'],['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#abed50a3b4fb6efb9a9a05b7c55c0edc2',1,'INCVMemAllocator::maxSize()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#a312414baa9360f6a2928e5b8a4570e56',1,'NCVMemNativeAllocator::maxSize()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#a492aadf40fab71f92b24f679e9f6a677',1,'NCVMemStackAllocator::maxSize()']]], + ['maxsizeatcompiletime_612',['MaxSizeAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da3a459062d39cb34452518f5f201161d2',1,'Eigen::DenseBase::MaxSizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da3a459062d39cb34452518f5f201161d2',1,'DenseBase< ArrayWrapper< ExpressionType > >::MaxSizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da3a459062d39cb34452518f5f201161d2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::MaxSizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da3a459062d39cb34452518f5f201161d2',1,'DenseBase< Solve< Decomposition, RhsType > >::MaxSizeAtCompileTime']]], + ['maxsurface1d_613',['maxSurface1D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a260dccdd9395ca059b60d2c250a7b19d',1,'cv::cuda::DeviceInfo']]], + ['maxsurface1dlayered_614',['maxSurface1DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a2c6c2d86c79673e0f003f72999901e0b',1,'cv::cuda::DeviceInfo']]], + ['maxsurface2d_615',['maxSurface2D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a5c46713e52796df8de5cc0675545b591',1,'cv::cuda::DeviceInfo']]], + ['maxsurface2dlayered_616',['maxSurface2DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ab382770adf2533cf52a6ec8dfdeceefd',1,'cv::cuda::DeviceInfo']]], + ['maxsurface3d_617',['maxSurface3D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#add5a8209f3a0a244bca9ce602a3ca8b9',1,'cv::cuda::DeviceInfo']]], + ['maxsurfacecubemap_618',['maxSurfaceCubemap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a380277029eb0760f3cdd599fdd6d6a68',1,'cv::cuda::DeviceInfo']]], + ['maxsurfacecubemaplayered_619',['maxSurfaceCubemapLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a6d2514b8ea311750d6640cb0a09ee885',1,'cv::cuda::DeviceInfo']]], + ['maxtexture1d_620',['maxTexture1D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a7dadb9baaef83deb18a19340eff89efd',1,'cv::cuda::DeviceInfo']]], + ['maxtexture1dlayered_621',['maxTexture1DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a63595aa52127a5e101aa2bd05bf21213',1,'cv::cuda::DeviceInfo']]], + ['maxtexture1dlinear_622',['maxTexture1DLinear',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a6ca6a1f3ccffbe4bcd082bb051a84709',1,'cv::cuda::DeviceInfo']]], + ['maxtexture1dmipmap_623',['maxTexture1DMipmap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8400034f3a46ec994d5f0b2b3097994d',1,'cv::cuda::DeviceInfo']]], + ['maxtexture2d_624',['maxTexture2D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a99a188ab0931a15cd512a75e7fa448b5',1,'cv::cuda::DeviceInfo']]], + ['maxtexture2dgather_625',['maxTexture2DGather',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a91932040e2174937d7db801dc51e37e1',1,'cv::cuda::DeviceInfo']]], + ['maxtexture2dlayered_626',['maxTexture2DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a868a27580ea696306c83aa5da2fea496',1,'cv::cuda::DeviceInfo']]], + ['maxtexture2dlinear_627',['maxTexture2DLinear',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#afe9b3a92a9832c6a8f52f8a006b8f297',1,'cv::cuda::DeviceInfo']]], + ['maxtexture2dmipmap_628',['maxTexture2DMipmap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#abd1a87ff21e6ace392634e05403618b6',1,'cv::cuda::DeviceInfo']]], + ['maxtexture3d_629',['maxTexture3D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#aed437fa43c5294c1fbb3f909a535ca57',1,'cv::cuda::DeviceInfo']]], + ['maxtexturecubemap_630',['maxTextureCubemap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ab66a0f8545b5f2b0104c56fe1373451c',1,'cv::cuda::DeviceInfo']]], + ['maxtexturecubemaplayered_631',['maxTextureCubemapLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a7fa8dda4989ff180a91d2d55377eab56',1,'cv::cuda::DeviceInfo']]], + ['maxthreadsdim_632',['maxThreadsDim',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#acd6c9806faa5718ac6ce46cf7f94b1b0',1,'cv::cuda::DeviceInfo']]], + ['maxthreadsperblock_633',['maxThreadsPerBlock',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ac90a47955f85b4b9b082f6f211562aa9',1,'cv::cuda::DeviceInfo']]], + ['maxthreadspermultiprocessor_634',['maxThreadsPerMultiProcessor',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8f827f2c363f19c7167479793f246bfa',1,'cv::cuda::DeviceInfo']]], + ['maxthreshold_635',['maxThreshold',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#addd6c9f61049769bcc301005daf21637',1,'cv::SimpleBlobDetector::Params']]], + ['maxtracklifetime_636',['maxTrackLifetime',['https://docs.opencv.org/4.2.0/d4/d80/structcv_1_1DetectionBasedTracker_1_1Parameters.html#a1649612b6899747cff2afe8f88ec1510',1,'cv::DetectionBasedTracker::Parameters']]], + ['maxtranslation_637',['maxTranslation',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#ad45b6d1d2cc318a78292678a1bb63979',1,'cv::rgbd::ICPOdometry::maxTranslation'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#af2eba6314e7454dfb3edf3929714a60a',1,'cv::rgbd::RgbdICPOdometry::maxTranslation'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a3b021249d8f1a332cb794c9c18cc571a',1,'cv::rgbd::RgbdOdometry::maxTranslation']]], + ['maxtreedepth_638',['maxTreeDepth',['https://docs.opencv.org/4.2.0/d1/dcc/structcv_1_1optflow_1_1GPCTrainingParams.html#a1b60a97150c8b5f3aa926e04d17ad864',1,'cv::optflow::GPCTrainingParams']]], + ['maxunpoollayer_639',['MaxUnpoolLayer',['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html',1,'cv::dnn']]], + ['maxval_640',['maxVal',['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a46c726cefa11ac616833ee3b67192acb',1,'cv::ml::ParamGrid::maxVal'],['https://docs.opencv.org/4.2.0/df/df5/structcv_1_1cudev_1_1ThreshBinaryFunc.html#a21509e9dd4b337e5c875c0703a0474e6',1,'cv::cudev::ThreshBinaryFunc::maxVal'],['https://docs.opencv.org/4.2.0/da/d5e/structcv_1_1cudev_1_1ThreshBinaryInvFunc.html#a0e2b89709a39dccdd53caa89c49bc073',1,'cv::cudev::ThreshBinaryInvFunc::maxVal']]], + ['maxval_5f_641',['maxVal_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84304ffdf1361fe076ec78d18d9b9e49',1,'cv::cudev::maxVal_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84304ffdf1361fe076ec78d18d9b9e49',1,'maxVal_()(Global Namespace)']]], + ['maxvalue_642',['maxValue',['https://docs.opencv.org/4.2.0/dc/dcd/classcv_1_1dnn_1_1ReLU6Layer.html#af51250f90f35f29f6b136da4db890f5c',1,'cv::dnn::ReLU6Layer']]], + ['maxworkgroupsize_643',['maxWorkGroupSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#afd60a223663d5b4951d585e9f167d54f',1,'cv::ocl::Device']]], + ['maxworkitemdims_644',['maxWorkItemDims',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a6c76e7f57a273ea51e3564a4f1269158',1,'cv::ocl::Device']]], + ['maxworkitemsizes_645',['maxWorkItemSizes',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a693878609398a5edafad71026661e41f',1,'cv::ocl::Device']]], + ['maxwriteimageargs_646',['maxWriteImageArgs',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#afc62c78591b741fdca19a729867686ca',1,'cv::ocl::Device']]], + ['mctkernel_647',['MCTKernel',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html',1,'cv::stereo::MCTKernel< num_images >'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a377cbc392538c3039bec7de2bb08f9cd',1,'cv::stereo::MCTKernel::MCTKernel()'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a84d81c259c0c425e804e8ecfa58e9970',1,'cv::stereo::MCTKernel::MCTKernel(uint8_t **images, int threshold)']]], + ['mdeg_5fhi_648',['mdeg_hi',['../structrobot_1_1potparams__t.html#aaccebb6ae121edbf0a82d1d148d5f1b3',1,'robot::potparams_t']]], + ['mdeg_5flo_649',['mdeg_lo',['../structrobot_1_1potparams__t.html#ae13661659fc4f1e0409529632325e025',1,'robot::potparams_t']]], + ['mean_650',['mean',['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a1bca9d1cc7808b7d08b2a046ee92cd11',1,'cv::PCA::mean'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abcc6e9b8ff25f5d1e076cb5f51f42231',1,'normal_distribution< double >::mean()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abcc6e9b8ff25f5d1e076cb5f51f42231',1,'normal_distribution< result_type >::mean()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abcc6e9b8ff25f5d1e076cb5f51f42231',1,'std::normal_distribution::mean()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a92604e5687496c6efcc7148840fb478c',1,'std::poisson_distribution::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'Eigen::DenseBase::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'DenseBase< ArrayWrapper< ExpressionType > >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'DenseBase< Solve< Decomposition, RhsType > >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'Eigen::VectorwiseOp::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Derived, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Derived, Vertical >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::mean()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga191389f8a0e58180bb13a727782cd461',1,'cv::mean()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa37ea1b811bcc3e26ee1b3fb00acc55c',1,'cv::gapi::mean()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga191389f8a0e58180bb13a727782cd461',1,'mean(InputArray src, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa37ea1b811bcc3e26ee1b3fb00acc55c',1,'mean(const GMat &src)(Global Namespace)']]], + ['meanandvariancealongrows_651',['meanAndVarianceAlongRows',['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga10bf67ff702c28406312748f905863ec',1,'cv::sfm::meanAndVarianceAlongRows()'],['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga10bf67ff702c28406312748f905863ec',1,'meanAndVarianceAlongRows()(Global Namespace)']]], + ['meankernelintegralimage_652',['MeanKernelIntegralImage',['https://docs.opencv.org/4.2.0/de/d9b/classcv_1_1stereo_1_1MeanKernelIntegralImage.html',1,'cv::stereo::MeanKernelIntegralImage'],['https://docs.opencv.org/4.2.0/de/d9b/classcv_1_1stereo_1_1MeanKernelIntegralImage.html#a4a35ad65bd56ee5110cde92a40bb6ca7',1,'cv::stereo::MeanKernelIntegralImage::MeanKernelIntegralImage()']]], + ['means_20clustering_653',['Means Clustering',['https://docs.opencv.org/4.2.0/d9/d70/tutorial_py_kmeans_index.html',1,'K-Means Clustering'],['https://docs.opencv.org/4.2.0/de/d4d/tutorial_py_kmeans_understanding.html',1,'Understanding K-Means Clustering']]], + ['means_20clustering_20in_20opencv_654',['K-Means Clustering in OpenCV',['https://docs.opencv.org/4.2.0/d1/d5c/tutorial_py_kmeans_opencv.html',1,'']]], + ['meanshift_655',['meanShift',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga432a563c94eaf179533ff1e83dbb65ea',1,'cv::meanShift()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga432a563c94eaf179533ff1e83dbb65ea',1,'meanShift(InputArray probImage, Rect &window, TermCriteria criteria)(Global Namespace)']]], + ['meanshift_20and_20camshift_656',['Meanshift and Camshift',['https://docs.opencv.org/4.2.0/d7/d00/tutorial_meanshift.html',1,'Meanshift and Camshift'],['https://docs.opencv.org/4.2.0/db/df8/tutorial_py_meanshift.html',1,'Meanshift and Camshift'],['https://docs.opencv.org/4.2.0/df/def/tutorial_js_meanshift.html',1,'Meanshift and Camshift']]], + ['meanshift_2emarkdown_657',['meanshift.markdown',['https://docs.opencv.org/4.2.0/d5/d2a/meanshift_8markdown.html',1,'']]], + ['meanshiftfiltering_658',['meanShiftFiltering',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gae13b3035bc6df0e512d876dbb8c00555',1,'cv::cuda::meanShiftFiltering()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gae13b3035bc6df0e512d876dbb8c00555',1,'meanShiftFiltering()(Global Namespace)']]], + ['meanshiftproc_659',['meanShiftProc',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga6039dc8ecbe2f912bc83fcc9b3bcca39',1,'cv::cuda::meanShiftProc()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga6039dc8ecbe2f912bc83fcc9b3bcca39',1,'meanShiftProc()(Global Namespace)']]], + ['meanshiftsegmentation_660',['meanShiftSegmentation',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga70ed80533a448829dc48cf22b1845c16',1,'cv::cuda::meanShiftSegmentation()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga70ed80533a448829dc48cf22b1845c16',1,'meanShiftSegmentation()(Global Namespace)']]], + ['meanstddev_661',['meanStdDev',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga846c858f4004d59493d7c6a4354b301d',1,'cv::meanStdDev()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga990a4db4c6d7e8f0f3a6685ba48fbddc',1,'cv::cuda::meanStdDev(InputArray mtx, Scalar &mean, Scalar &stddev)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac0e8dc0bb32fda5afd32de0f18817587',1,'cv::cuda::meanStdDev(InputArray mtx, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga846c858f4004d59493d7c6a4354b301d',1,'meanStdDev(InputArray src, OutputArray mean, OutputArray stddev, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga990a4db4c6d7e8f0f3a6685ba48fbddc',1,'meanStdDev(InputArray mtx, Scalar &mean, Scalar &stddev)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac0e8dc0bb32fda5afd32de0f18817587',1,'meanStdDev(InputArray mtx, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], + ['measurement_662',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], + ['measurement_20and_20improvement_20techniques_663',['Performance Measurement and Improvement Techniques',['https://docs.opencv.org/4.2.0/dc/d71/tutorial_py_optimization.html',1,'']]], + ['measurement_20with_20opencv_664',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], + ['measurementfunction_665',['measurementFunction',['https://docs.opencv.org/4.2.0/da/d2b/classcv_1_1tracking_1_1UkfSystemModel.html#ae8f272725272a23cc45dee75fb65349d',1,'cv::tracking::UkfSystemModel']]], + ['measurementmatrix_666',['measurementMatrix',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a0f60b78726d8eccf74a1f2479c2d1f97',1,'cv::KalmanFilter']]], + ['measurementnoisecov_667',['measurementNoiseCov',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a828d051035ba807966ad65edf288a08e',1,'cv::KalmanFilter::measurementNoiseCov'],['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a58d639ff6b3e3d64502b067b89214402',1,'cv::tracking::UnscentedKalmanFilterParams::measurementNoiseCov']]], + ['med_5fcrossings_668',['med_crossings',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a3acd75476c774c25b874b0aab2531ec2',1,'cv::text::ERStat']]], + ['media_20highgui_20module_669',['High Level GUI and Media (highgui module)',['https://docs.opencv.org/4.2.0/d0/de2/tutorial_table_of_content_highgui.html',1,'']]], + ['median1x9filter_670',['Median1x9Filter',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a4bdb66993689eb64dcb63f8b81c6046c',1,'cv::stereo::Matching']]], + ['median9x1filter_671',['Median9x1Filter',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#ac2a8d29abd0681427dbaac6819e88b11',1,'cv::stereo::Matching']]], + ['medianblur_672',['medianBlur',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga564869aa33e58769b4469101aac458f9',1,'cv::medianBlur()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga90c28c4986e8117ecb1b61300ff3e7e8',1,'cv::gapi::medianBlur()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga564869aa33e58769b4469101aac458f9',1,'medianBlur(InputArray src, OutputArray dst, int ksize)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga90c28c4986e8117ecb1b61300ff3e7e8',1,'medianBlur(const GMat &src, int ksize)(Global Namespace)']]], + ['mem_5ffn_673',['mem_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html#gadd917dd05154842bc6aebcf5c90abb7f',1,'std::mem_fn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html#gadd917dd05154842bc6aebcf5c90abb7f',1,'mem_fn()(Global Namespace)']]], + ['mem_5ffun1_5fref_5ft_674',['mem_fun1_ref_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07643.html',1,'std']]], + ['mem_5ffun1_5ft_675',['mem_fun1_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07635.html',1,'std']]], + ['mem_5ffun_5fref_5ft_676',['mem_fun_ref_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07627.html',1,'std']]], + ['mem_5ffun_5ft_677',['mem_fun_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07619.html',1,'std']]], + ['membaseaddralign_678',['memBaseAddrAlign',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ad13666f3a1309fd46afddeee390049d1',1,'cv::ocl::Device']]], + ['member_5ftype_679',['member_type',['https://docs.opencv.org/4.2.0/db/d0d/structcv_1_1ParamType_3_01__Tp_00_01typename_01std_1_1enable__if_3_01std_1_1is__enum_3_01__Tp_01_4_1_1value_01_4_1_1type_01_4.html#a0742037bb334272b50f79529057a6bdd',1,'cv::ParamType< _Tp, typename std::enable_if< std::is_enum< _Tp >::value >::type >::member_type'],['https://docs.opencv.org/4.2.0/d2/d39/structcv_1_1ParamType_3_01Algorithm_01_4.html#a5a4291ac78bc1fe7d3d13ed9ef4e5c36',1,'cv::ParamType< Algorithm >::member_type'],['https://docs.opencv.org/4.2.0/d1/d87/structcv_1_1ParamType_3_01bool_01_4.html#a964f22530bde824b0e0b235910a24861',1,'cv::ParamType< bool >::member_type'],['https://docs.opencv.org/4.2.0/d4/d98/structcv_1_1ParamType_3_01double_01_4.html#a6794ef3ad81ebde269e87cbd525346f3',1,'cv::ParamType< double >::member_type'],['https://docs.opencv.org/4.2.0/dd/df2/structcv_1_1ParamType_3_01float_01_4.html#ac43101978b056f5e4df09e46d0f028ba',1,'cv::ParamType< float >::member_type'],['https://docs.opencv.org/4.2.0/db/d5f/structcv_1_1ParamType_3_01Mat_01_4.html#a64a15830a193000b5313eee5f956a8f4',1,'cv::ParamType< Mat >::member_type'],['https://docs.opencv.org/4.2.0/d2/dda/structcv_1_1ParamType_3_01Scalar_01_4.html#a208d9d406c54735de6340378877c7d22',1,'cv::ParamType< Scalar >::member_type'],['https://docs.opencv.org/4.2.0/dc/d1c/structcv_1_1ParamType_3_01std_1_1vector_3_01Mat_01_4_01_4.html#a4888173117027981f98e76c7fd1b1cfe',1,'cv::ParamType< std::vector< Mat > >::member_type'],['https://docs.opencv.org/4.2.0/d0/d5f/structcv_1_1ParamType_3_01String_01_4.html#ac2b64e3e485f29a294945fca9c3f056e',1,'cv::ParamType< String >::member_type'],['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1ParamType_3_01uchar_01_4.html#a54a369a0c03aeb81c490b95cd4988d33',1,'cv::ParamType< uchar >::member_type'],['https://docs.opencv.org/4.2.0/dc/d63/structcv_1_1ParamType_3_01uint64_01_4.html#a898892dcc53b03d30896d17362b86bd0',1,'cv::ParamType< uint64 >::member_type'],['https://docs.opencv.org/4.2.0/d7/d68/structcv_1_1ParamType_3_01unsigned_01_4.html#a4077fed0defda475e5a7f94dc0f43471',1,'cv::ParamType< unsigned >::member_type']]], + ['members_680',['Structures Having Eigen Members',['https://eigen.tuxfamily.org/dox/group__TopicStructHavingEigenMembers.html',1,'']]], ['members_681',['Adaptors for pointers to members',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01511.html',1,'']]], - ['members_682',['Structures Having Eigen Members',['https://eigen.tuxfamily.org/dox/group__TopicStructHavingEigenMembers.html',1,'']]], - ['memoptypetostr_683',['memopTypeToStr',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga3a8b3c8a8991e15ac4e4aa2a007bb2ea',1,'cv::ocl::memopTypeToStr()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga3a8b3c8a8991e15ac4e4aa2a007bb2ea',1,'memopTypeToStr(int t)(Global Namespace)']]], - ['memory_684',['memory',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00107.html',1,'']]], - ['memory_685',['MEMORY',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482dabdde7670c9c7e472f8445932ea7cbbf7',1,'cv::FileStorage']]], - ['memory_686',['memory',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ac2d4047459c677a9369c27e277484973',1,'cv::util::variant::memory'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ac2d4047459c677a9369c27e277484973',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::memory']]], - ['memory_687',['Memory',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01480.html',1,'']]], - ['memory_20images_20in_20the_20visual_20studio_20debugger_688',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['memory_5forder_689',['memory_order',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gab4f8c60de95c10793a8e3e27fcb800d9',1,'std::memory_order'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gab4f8c60de95c10793a8e3e27fcb800d9',1,'memory_order(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga7163c4f13e7624eb78b16bb599a72f98',1,'std::memory_order'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga7163c4f13e7624eb78b16bb599a72f98',1,'memory_order(Global Namespace)']]], - ['memory_5fresource_690',['memory_resource',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01013.html',1,'']]], - ['memorybuswidth_691',['memoryBusWidth',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#adc029e9b7100063a9646a50435f55ed3',1,'cv::cuda::DeviceInfo']]], - ['memoryclockrate_692',['memoryClockRate',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a014f96fb7cd5639480347e7de85686be',1,'cv::cuda::DeviceInfo']]], - ['memoryflag_693',['MemoryFlag',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12',1,'cv::UMatData']]], - ['memoryfwd_2eh_694',['memoryfwd.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00422.html',1,'']]], - ['mempitch_695',['memPitch',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ac9923f30632f9a587a0d5f971fdfaf62',1,'cv::cuda::DeviceInfo']]], - ['memsegcopyhelper_696',['memSegCopyHelper',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga75faff2ec1d14c63918ee02e74e988cc',1,]]], - ['memsegcopyhelper2d_697',['memSegCopyHelper2D',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga253a695ab7a336ebb07008593565cd4c',1,]]], - ['memtype_698',['memtype',['https://docs.opencv.org/4.2.0/d6/d86/structNCVMemPtr.html#a315eb985d5ea3d3fa803a8882e5d4daa',1,'NCVMemPtr']]], - ['memtype_699',['memType',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#af8070dc8c7faee07938281306cacf0c8',1,'INCVMemAllocator::memType()'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#a11fb3dc94bd7225421630e4491e226bb',1,'NCVMatrix::memType()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#af82dd02192ab82e59eb264a8c0aee539',1,'NCVMemNativeAllocator::memType()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#ae28f33a2fb00ad0f9e0ed4ba7d48bc34',1,'NCVMemStackAllocator::memType()'],['https://docs.opencv.org/4.2.0/dc/d73/classNCVVector.html#a6b686f2701af81ddd34aa121246bca01',1,'NCVVector::memType()']]], - ['mercatorprojector_700',['MercatorProjector',['https://docs.opencv.org/4.2.0/d1/daa/structcv_1_1detail_1_1MercatorProjector.html',1,'cv::detail']]], - ['mercatorwarper_701',['MercatorWarper',['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1detail_1_1MercatorWarper.html',1,'cv::detail::MercatorWarper'],['https://docs.opencv.org/4.2.0/de/d04/classcv_1_1MercatorWarper.html',1,'cv::MercatorWarper'],['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1detail_1_1MercatorWarper.html#a3db79c1c7a45176cd58da433556769c9',1,'cv::detail::MercatorWarper::MercatorWarper()']]], - ['merge_702',['merge',['https://docs.opencv.org/4.2.0/df/d2e/group__core__hal__interface__merge.html',1,'Channel merge'],['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategy.html#a161d214c83db7e0dc0812dabed6674fb',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentationStrategy::merge()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4d6a44991e6e9a4f1d74236e7d6fc012',1,'list< __inp, __rebind_inp >::merge(list &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a44306154a6f093d8168eff45b90aa3ad',1,'list< __inp, __rebind_inp >::merge(list &&__x, _StrictWeakOrdering __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a4794e46af448c443019e9b36640744ab',1,'std::forward_list::merge(forward_list &&__list)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a0de7b075b73cc0a843447ad75cba4b87',1,'std::forward_list::merge(forward_list &&__list, _Comp __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4d6a44991e6e9a4f1d74236e7d6fc012',1,'std::list::merge(list &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a44306154a6f093d8168eff45b90aa3ad',1,'std::list::merge(list &&__x, _StrictWeakOrdering __comp)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7d7b4d6c6ee504b30a20b1680029c7b4',1,'cv::merge(const Mat *mv, size_t count, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga61f2f2bde4a0a0154b2333ea504fab1d',1,'cv::merge(InputArrayOfArrays mv, OutputArray dst)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaac939dc3b178ee92fb6e7078f342622c',1,'cv::cuda::merge(const GpuMat *src, size_t n, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gafce19eb0fcad23f67ab45d544992436d',1,'cv::cuda::merge(const std::vector< GpuMat > &src, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7d7b4d6c6ee504b30a20b1680029c7b4',1,'merge(const Mat *mv, size_t count, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga61f2f2bde4a0a0154b2333ea504fab1d',1,'merge(InputArrayOfArrays mv, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaac939dc3b178ee92fb6e7078f342622c',1,'merge(const GpuMat *src, size_t n, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gafce19eb0fcad23f67ab45d544992436d',1,'merge(const std::vector< GpuMat > &src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabb18bc670a27e539246a2eb154f60351',1,'std::merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7f7771648d074e296d019153633efa8d',1,'std::merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabb18bc670a27e539246a2eb154f60351',1,'merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7f7771648d074e296d019153633efa8d',1,'merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)(Global Namespace)']]], - ['merge_2eh_703',['merge.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00917.html',1,'']]], - ['merge16u_704',['merge16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf3380647212f442cdc89ada0d26e5dd1',1,'cv::hal::merge16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf3380647212f442cdc89ada0d26e5dd1',1,'merge16u()(Global Namespace)']]], - ['merge3_705',['merge3',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaf63e894270a088695e6ec97d9a903971',1,'cv::gapi::merge3()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaf63e894270a088695e6ec97d9a903971',1,'merge3()(Global Namespace)']]], - ['merge32s_706',['merge32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6d608cfae074f0f75db7e7f4e760be0f',1,'cv::hal::merge32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6d608cfae074f0f75db7e7f4e760be0f',1,'merge32s()(Global Namespace)']]], - ['merge4_707',['merge4',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga8206d42b933edcbf08d6953e202d0dd0',1,'cv::gapi::merge4()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga8206d42b933edcbf08d6953e202d0dd0',1,'merge4()(Global Namespace)']]], - ['merge64s_708',['merge64s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5e717dd8d0a41c6c06793ab9308c8fc6',1,'cv::hal::merge64s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5e717dd8d0a41c6c06793ab9308c8fc6',1,'merge64s()(Global Namespace)']]], - ['merge8u_709',['merge8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6b834e84af204ef9becc0805dca5caab',1,'cv::hal::merge8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6b834e84af204ef9becc0805dca5caab',1,'merge8u()(Global Namespace)']]], - ['merge_5fminimal_5fn_710',['merge_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a6daa1846a1a935cd6ec684087e063ac4',1,'__gnu_parallel::_Settings']]], - ['merge_5foversampling_711',['merge_oversampling',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a14ded8ea54764e899f1d24ef1fe12b19',1,'__gnu_parallel::_Settings']]], - ['merge_5fpatch_712',['merge_patch',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a844a77cb154752d12118f10af26d54cb.html#a844a77cb154752d12118f10af26d54cb',1,'nlohmann::basic_json']]], - ['merged_713',['merged',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a59eb62d949598853fbc83836e8f2960c',1,'Eigen::AlignedBox']]], - ['mergeddescriptors_714',['mergedDescriptors',['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#af89f9c161a310152714934252aef681f',1,'cv::DescriptorMatcher::DescriptorCollection::mergedDescriptors'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a990859c4f84b04b3ced4411b3a62e7cc',1,'cv::FlannBasedMatcher::mergedDescriptors']]], - ['mergedebevec_715',['MergeDebevec',['https://docs.opencv.org/4.2.0/df/d62/classcv_1_1MergeDebevec.html',1,'cv']]], - ['mergeexposures_716',['MergeExposures',['https://docs.opencv.org/4.2.0/d6/d5e/classcv_1_1MergeExposures.html',1,'cv']]], - ['mergemertens_717',['MergeMertens',['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html',1,'cv']]], - ['mergerobertson_718',['MergeRobertson',['https://docs.opencv.org/4.2.0/d7/d5b/classcv_1_1MergeRobertson.html',1,'cv']]], - ['mergesets_719',['mergeSets',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#ace5164c3b1500421c96c7b6cc4dfaa9d',1,'cv::detail::DisjointSets']]], - ['mersenne_5ftwister_5fengine_720',['mersenne_twister_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html',1,'std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8987d5bb70c31ba8e4bb80f993acff85',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::mersenne_twister_engine()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8987d5bb70c31ba8e4bb80f993acff85',1,'std::mersenne_twister_engine::mersenne_twister_engine()']]], - ['mersenne_5ftwister_5fengine_3c_20uint_5ffast32_5ft_2c_2032_2c_20624_2c_20397_2c_2031_2c_200x9908b0dful_2c_2011_2c_200xfffffffful_2c_207_2c_200x9d2c5680ul_2c_2015_2c_200xefc60000ul_2c_2018_2c_201812433253ul_20_3e_721',['mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html',1,'']]], - ['mesh_722',['Mesh',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html',1,'cv::viz']]], - ['messages_723',['messages',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html',1,'std::messages< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a7cfad8ee6c5f1275b9862c63bd5d5241',1,'std::locale::messages'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a71483d79d47eaf8f3739c4b6b971b00e',1,'std::messages::messages(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a8cfe4d6b3be654727ca4f705c27b3d51',1,'std::messages::messages(__c_locale __cloc, const char *__s, size_t __refs=0)']]], - ['messages_5fbase_724',['messages_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06031.html',1,'std']]], - ['messages_5fbyname_725',['messages_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06039.html',1,'std']]], - ['messages_5fmembers_2eh_726',['messages_members.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00710.html',1,'']]], - ['meta_727',['meta',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#acd5da358f7568c97824b029596f92b11',1,'cv::gapi::fluid::Buffer::meta()'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#a0b7410b59963f6fb33bdc2a45c518960',1,'cv::gapi::fluid::View::meta()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a351b4f65014f6c2b8b2832847d44bbd7.html#a351b4f65014f6c2b8b2832847d44bbd7',1,'nlohmann::basic_json::meta()']]], - ['meta_20module_728',['Sparse meta-module',['https://eigen.tuxfamily.org/dox/group__Sparse__Module.html',1,'']]], - ['metadata_20descriptors_729',['G-API Metadata Descriptors',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html',1,'']]], - ['metadata_5fconst_5freference_730',['metadata_const_reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a1cc97219243280077e011641b5a34d7c',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::metadata_const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a1cc97219243280077e011641b5a34d7c',1,'__gnu_pbds::detail::bin_search_tree_node_it_::metadata_const_reference']]], - ['metadata_5freference_731',['metadata_reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#a9b1f819009fec959d74668594f98852d',1,'__gnu_pbds::lu_counter_policy::metadata_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html#abed5686c84f4f62f95894f692a53fedf',1,'__gnu_pbds::lu_move_to_front_policy::metadata_reference']]], - ['metadata_5ftype_732',['metadata_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7eb0036cd037c9139ab0019c557be22d',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::metadata_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7eb0036cd037c9139ab0019c557be22d',1,'__gnu_pbds::detail::bin_search_tree_node_it_::metadata_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a28fd8a987e41c1d2f3d413b8018f7957',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::metadata_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a28fd8a987e41c1d2f3d413b8018f7957',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::metadata_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#aa53180229ff61fd4f105cd893740b12d',1,'__gnu_pbds::lu_counter_policy::metadata_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html#acfcd460068d88a84f3931c05942fd979',1,'__gnu_pbds::lu_move_to_front_policy::metadata_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#ae04b006c23ec3b6064311bd1df20ba8c',1,'__gnu_pbds::sample_update_policy::metadata_type']]], - ['metahelper_733',['MetaHelper',['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1MetaHelper.html',1,'cv::detail']]], - ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20args_2e_2e_2e_20_3e_2c_20r_20_3e_734',['MetaHelper< K, std::tuple< Args... >, R >',['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1MetaHelper.html',1,'']]], - ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20args_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20r_2e_2e_2e_20_3e_20_3e_735',['MetaHelper< K, std::tuple< Args... >, std::tuple< R... > >',['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1MetaHelper.html',1,'']]], - ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20out_20_3e_736',['MetaHelper< K, std::tuple< Ins... >, Out >',['https://docs.opencv.org/4.2.0/db/dff/structcv_1_1detail_1_1MetaHelper_3_01K_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01Out_01_4.html',1,'cv::detail']]], - ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20outs_2e_2e_2e_20_3e_20_3e_737',['MetaHelper< K, std::tuple< Ins... >, std::tuple< Outs... > >',['https://docs.opencv.org/4.2.0/d1/dde/structcv_1_1detail_1_1MetaHelper_3_01K_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_1tuple_3_01Outs_8_8_8_01_4_01_4.html',1,'cv::detail']]], - ['metaprogramming_738',['Metaprogramming',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html',1,'']]], - ['metas_739',['metas',['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ae105107abedd589e94153a0e6f916367',1,'cv::GCompiled::metas()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#a027d4aa5e0fef550fe7389984482b3a5',1,'cv::GStreamingCompiled::metas()']]], - ['metatype_740',['MetaType',['https://docs.opencv.org/4.2.0/db/d79/structcv_1_1detail_1_1MetaType.html',1,'cv::detail']]], - ['metatype_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_741',['MetaType< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/d4/d91/structcv_1_1detail_1_1MetaType_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], - ['metatype_3c_20cv_3a_3agmat_20_3e_742',['MetaType< cv::GMat >',['https://docs.opencv.org/4.2.0/d0/dcf/structcv_1_1detail_1_1MetaType_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], - ['metatype_3c_20cv_3a_3agmatp_20_3e_743',['MetaType< cv::GMatP >',['https://docs.opencv.org/4.2.0/dc/d9f/structcv_1_1detail_1_1MetaType_3_01cv_1_1GMatP_01_4.html',1,'cv::detail']]], - ['metatype_3c_20cv_3a_3agscalar_20_3e_744',['MetaType< cv::GScalar >',['https://docs.opencv.org/4.2.0/de/d91/structcv_1_1detail_1_1MetaType_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], - ['meterstogps_745',['metersToGPS',['../classGPSToMetersConverter.html#a434ba240ca25217c058cfa2b3f58b68d',1,'GPSToMetersConverter']]], - ['method_746',['Fast Marching Method',['https://docs.opencv.org/4.2.0/db/d18/group__videostab__marching.html',1,'']]], - ['method_5f_747',['method_',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#aede8d82640760ef005cdbee8b23349f4',1,'cv::rgbd::DepthCleaner::method_'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#af2c4bd93cb03e77618c6c6aa1fb70ee6',1,'cv::rgbd::RgbdNormals::method_']]], - ['methodid_748',['methodId',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#afbbc6da65b06b05e696bfa95b3326f52',1,'cv::structured_light::SinusoidalPattern::Params']]], - ['methods_749',['Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'How to Use Background Subtraction Methods'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'Improved Background-Foreground Segmentation Methods'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a11394898c4732995dd3af8a665f92894',1,'cv::ml::LogisticRegression::Methods']]], - ['metisordering_750',['MetisOrdering',['https://eigen.tuxfamily.org/dox/classEigen_1_1MetisOrdering.html',1,'Eigen']]], - ['metissupport_20module_751',['MetisSupport module',['https://eigen.tuxfamily.org/dox/group__MetisSupport__Module.html',1,'']]], - ['microseconds_752',['microseconds',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#a4b023048c2f5e3644ccc58a80ae381ad',1,'std::chrono']]], - ['microsoft_20visual_20studio_753',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['middlebutton_754',['MiddleButton',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#ada240f2528500ad1615e76fb2fd9e2baacd85df21decb225a207beaca4c1a3778',1,'cv::viz::MouseEvent']]], - ['milliseconds_755',['milliseconds',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#a979a98673e4244630e142461b1026d74',1,'std::chrono']]], - ['min_756',['Min',['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1Min.html',1,'cv::cudev']]], - ['min_757',['min',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac22d7d32f1ec91fd106760a98a6f4731',1,'cv::MatExpr::min(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aafbfd6a44196ca5f40bcea5136548c22',1,'cv::MatExpr::min(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a865832a7380156566594f039d4ff0ff6',1,'cv::MatExpr::min(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6fdbec4b3fdb2b23f1d79bc73640d371',1,'cv::MatExpr::min(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a176d14d2ffed87f4e024d4933104a2bb',1,'cv::MatExpr::min(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac22d7d32f1ec91fd106760a98a6f4731',1,'cv::MatExpr::min(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aafbfd6a44196ca5f40bcea5136548c22',1,'cv::MatExpr::min(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a865832a7380156566594f039d4ff0ff6',1,'cv::MatExpr::min(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6fdbec4b3fdb2b23f1d79bc73640d371',1,'cv::MatExpr::min(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a176d14d2ffed87f4e024d4933104a2bb',1,'cv::MatExpr::min(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/da/d81/structcv_1_1cudev_1_1numeric__limits_3_01bool_01_4.html#a359fab492885fe351389d0f3b99e304a',1,'cv::cudev::numeric_limits< bool >::min()'],['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html#a079f77010993f609c5834184a3fc571e',1,'cv::cudev::numeric_limits< double >::min()'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html#aea8ce5e57cd0c36d0ca81a523e0640a1',1,'cv::cudev::numeric_limits< float >::min()'],['https://docs.opencv.org/4.2.0/da/d4e/structcv_1_1cudev_1_1numeric__limits_3_01schar_01_4.html#a22dd9ab6b9d4491a33a70c432e868187',1,'cv::cudev::numeric_limits< schar >::min()'],['https://docs.opencv.org/4.2.0/d1/d8b/structcv_1_1cudev_1_1numeric__limits_3_01short_01_4.html#a63563af1d24632a4b6d62cc168d54a06',1,'cv::cudev::numeric_limits< short >::min()'],['https://docs.opencv.org/4.2.0/d3/dc7/structcv_1_1cudev_1_1numeric__limits_3_01uchar_01_4.html#aac19eaa31ded65f911830b3f45e4e5ba',1,'cv::cudev::numeric_limits< uchar >::min()'],['https://docs.opencv.org/4.2.0/dd/d89/structcv_1_1cudev_1_1numeric__limits_3_01uint_01_4.html#ab9f226ae2e962a64a9ba9d89e1ecf288',1,'cv::cudev::numeric_limits< uint >::min()'],['https://docs.opencv.org/4.2.0/df/d47/structcv_1_1cudev_1_1numeric__limits_3_01ushort_01_4.html#a541b9509bbd6782ccf98bf2abc68380b',1,'cv::cudev::numeric_limits< ushort >::min()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9a426dcd6be0bd77995b636fe291e6d0',1,'cv::softdouble::min()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga2473116e9ce9a101a7e6ed53753df9b6',1,'cv::softfloat::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a7dc4b8a5f0edcf447683b93607a8441e',1,'gamma_distribution< double >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a7dc4b8a5f0edcf447683b93607a8441e',1,'gamma_distribution< result_type >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#aaf1720ef1664fa77a5972c78addfa290',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#aa79e79b65edcb6f45dda08b3efdff9e8',1,'normal_distribution< double >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#aa79e79b65edcb6f45dda08b3efdff9e8',1,'normal_distribution< result_type >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#acfd63c2f93e6215cd8304db6f5c39df4',1,'std::bernoulli_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a0dcaff746d5993e73b30cbbc70afbd05',1,'std::binomial_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#a93cbd65b4fa6d5a84149a0db63c7e10c',1,'std::cauchy_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a71039379ac60b7df94b625c4a45cb287',1,'std::chi_squared_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a16286565620fc6966ca53540572ede38',1,'std::discard_block_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a2ea8319bc859527d8a4f22380ab85672',1,'std::discrete_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a21226cd61a367799a695c438f6c0af26',1,'std::exponential_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#aa97af0bfaca27148976ef1a65ab257c5',1,'std::extreme_value_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a7b129ca3a6af6d6d063ecde317361ef8',1,'std::fisher_f_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a7dc4b8a5f0edcf447683b93607a8441e',1,'std::gamma_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#af711039331910d5b184bfcdb43e4e12b',1,'std::geometric_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a5900ce9b2214d848cce14cb82ce71397',1,'std::independent_bits_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a57c283a281f9b007e0a7659b57586f52',1,'std::linear_congruential_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#aa6d60ac02923738e93e5cc2813d9cfea',1,'std::lognormal_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#aaf1720ef1664fa77a5972c78addfa290',1,'std::mersenne_twister_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#ab4c3074bd3f87187e7de81a5ece8522c',1,'std::negative_binomial_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#aa79e79b65edcb6f45dda08b3efdff9e8',1,'std::normal_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#aae25581f91ebab83161d2da3fe0cdb9d',1,'std::numeric_limits::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a1d4e28300518616fef3f4b93a3d1d10d',1,'std::piecewise_constant_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#adaf7520277cc879942d011de156dc184',1,'std::piecewise_linear_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#afb49039795f3c63e256f6b4d2cfab433',1,'std::poisson_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a113fdc5d67d45435e869a9e905a3c658',1,'std::shuffle_order_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a40bd6b63baec90b927fc13bb5d3b2bba',1,'std::student_t_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a945725b8377db61951fc9c79a0f9aac1',1,'std::subtract_with_carry_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a6e74f2a2cb1d736ac814efd4691f7fe0',1,'std::uniform_int_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#a7e6fbfe7a4278ebf8a85cb9b4afa6ec2',1,'std::uniform_real_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41cf9f2fac24470499589628f657be67',1,'std::valarray::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a3060d7ec6a83eb719429f3a0677705ff',1,'std::weibull_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41cf9f2fac24470499589628f657be67',1,'valarray< size_t >::min()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#adad123f7e84a2437806a791b96af04bd',1,'Eigen::AlignedBox::min()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#af7fddcf06b60392f3f21b4d8e0f763a0',1,'Eigen::AlignedBox::min() const']]], - ['min_758',['Min',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a600b5a58e77104ef7281dba6dcffb808',1,'Eigen::AlignedBox']]], - ['min_759',['min',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac48df53b8fd34b87e7b121fa8fd4c379',1,'cv::min(const softfloat &a, const softfloat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf625702f70e571f33784b0652be9a7b7',1,'cv::min(const softdouble &a, const softdouble &b)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9af368f182ee76d0463d0d8d5330b764',1,'cv::min(InputArray src1, InputArray src2, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0b8852cd1a92366860e390e8abbe78dc',1,'cv::min(const Mat &src1, const Mat &src2, Mat &dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa83bf3dce9a4a488675347fff6692cb9',1,'cv::min(const UMat &src1, const UMat &src2, UMat &dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga74f0b05a65b3d949c237abb5e6c60867',1,'cv::cuda::min()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166301154ec0c6fb8859c8126e013fac',1,'cv::cudev::min(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37cfadd8b02bc1989b2ff264d915a6b',1,'cv::cudev::min(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e7580e80893052d84dfb5ec5ca5f766',1,'cv::cudev::min(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99931470f4d68820bbc5459ed795da8d',1,'cv::cudev::min(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f515695538396fb8648b71901d058d',1,'cv::cudev::min(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad2901b8dd9a2efa1ea3a075ddf2d3f8',1,'cv::cudev::min(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga580140f65047fb3188cd74f2d0f69a08',1,'cv::cudev::min(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf199b5514de7c6a6af1b2c73c5725b7b',1,'cv::cudev::min(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa618ba2f3832b30d643cce7efa62a04c',1,'cv::cudev::min(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c687dbc301bada436f1b666ac1ad4de',1,'cv::cudev::min(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad638c54878b6ccf16f85915845369fb8',1,'cv::cudev::min(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77ec7dd3c8bf8d93adb1a0ae89226dc0',1,'cv::cudev::min(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68ba59a2fd07a335aa566788ae5b6dd8',1,'cv::cudev::min(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga570aa1a8375e90a96942ba5a9d73a8b9',1,'cv::cudev::min(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c5a8171954561ee7d86bad9a5b69ca',1,'cv::cudev::min(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d89f72aa99839fa446920cee353de8',1,'cv::cudev::min(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad897218ccbbb0e9cc8660213479afad2',1,'cv::cudev::min(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga211f9a750f17f04c671e1ecff782d3b0',1,'cv::cudev::min(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga534ff33d0fb6a9f231c45e11ec109c06',1,'cv::cudev::min(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76547c7e7ce1e38e4bfbc95c41f211a9',1,'cv::cudev::min(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f48115719f2492736e6c1e6e54b47bc',1,'cv::cudev::min(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea84f0591c4aa8110ee233fd83f3b2e7',1,'cv::cudev::min(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29bc62147e04bbc4d5cc713722b3ebc7',1,'cv::cudev::min(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a27832d49d358b841977db8ac614fe',1,'cv::cudev::min(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga874939daee476a502f9e25a60d11a0af',1,'cv::cudev::min(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17b5b845d773a38304e10c6f6ef7a63b',1,'cv::cudev::min(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40ba01d1818bae80a0b25cced8a91b0e',1,'cv::cudev::min(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ea00427d284684a5381f925c8865413',1,'cv::cudev::min(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e3b6cc4c9f631582962e2e8a570974',1,'cv::cudev::min(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cbeba62c9983bec445ede74fe15c5d',1,'cv::cudev::min(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a26ede9e7b8aff8af95843ae065a3d6',1,'cv::cudev::min(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3b5b82737560408526a05e60a01cf0c',1,'cv::cudev::min(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50b5e9c2bd4b51a9ca871a2affbab6be',1,'cv::cudev::min(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bc7c6f847a6b03438d75ad28b20e50',1,'cv::cudev::min(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5700161b6d3d48c4f6b6cb8f6893a77d',1,'cv::cudev::min(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7e88fd0b276bc8f582117afba6f69b8',1,'cv::cudev::min(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ebc299c55f1c956ba1bf59818339a9',1,'cv::cudev::min(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490a5a4ee4b491ca52355d3591963d36',1,'cv::cudev::min(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3deb31d4bd9746fe908aae0a32876a67',1,'cv::cudev::min(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7443e024eba9d6e7dba462db0f87b09',1,'cv::cudev::min(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f584667f590a24d7952bba2c38b9d38',1,'cv::cudev::min(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fa8e7016286ff7a654d7f61c0b229ed',1,'cv::cudev::min(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbdb0b1d874b4d611fbe2fc87aa6723e',1,'cv::cudev::min(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25355dc07c2a9bcfe29dd47ffbd1af1f',1,'cv::cudev::min(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga968ddc4b3f1330fd8bba47996a879279',1,'cv::cudev::min(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00c88b38b31430626b18a806bab64102',1,'cv::cudev::min(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01ef9f5f0c55a33ed31f61b8996a9ef2',1,'cv::cudev::min(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b6e96bf59d8775fe468c8b0f0cd4c59',1,'cv::cudev::min(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053670b49cc762f89cd71a48a23410b2',1,'cv::cudev::min(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ae5c5fe2a9037803d26dc7ac9dc84e6',1,'cv::cudev::min(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebde1cc8ab3c8a2489f018498b4af0e1',1,'cv::cudev::min(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga328aabd669c55a39527628ca404d6d68',1,'cv::cudev::min(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695465274932c09378b6c197485b592e',1,'cv::cudev::min(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga428a2859cdb238bbbbf2fdb9215514bc',1,'cv::cudev::min(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8c71d074f87253f2743bf2d51342f58',1,'cv::cudev::min(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad695d4aa08dad8457dc787eb5b973397',1,'cv::cudev::min(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0500af3d7867bfd51c3cad36ba0a491e',1,'cv::cudev::min(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40714aaf703568f042ac2334279c96be',1,'cv::cudev::min(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79fc45bfa8191d6dacaf6d791c8d657d',1,'cv::cudev::min(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf2fc475cfe7c1829fa659aad92f5311',1,'cv::cudev::min(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3311a28f02b9f7f2322042ba73793dc',1,'cv::cudev::min(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga578896b54a57ff07a3bf7d0c3fd2543f',1,'cv::cudev::min(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc186a6d010c07d69d9f2659f91f172',1,'cv::cudev::min(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c0b1bc40a2ec46f6eb78af0a80253e',1,'cv::cudev::min(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a838e528321de5c93cd881016818f4',1,'cv::cudev::min(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae91887a3df27695bfac7c04a17e7f317',1,'cv::cudev::min(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d81f05a2715d7b4869c831e948241f',1,'cv::cudev::min(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ffc1aaa7e1fbf701e7c705005bbddb',1,'cv::cudev::min(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1dccc25340fb0aaebd5570168f9523f',1,'cv::cudev::min(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6db34e52d79cc78bb82d6473ed9d260b',1,'cv::cudev::min(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d9172e56b98d1e9db062064c8871c2a',1,'cv::cudev::min(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43a5a174cfe82f50b81cae0fef539eb2',1,'cv::cudev::min(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a35bdd7cf565b9ade2b66e59bd0ed',1,'cv::cudev::min(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f2de1cd74a26036c9655cac8f4fd12b',1,'cv::cudev::min(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bbfbc5daa53d92b244b57ea9c7001b3',1,'cv::cudev::min(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c0105c80bfe524779da1b354f6757e6',1,'cv::cudev::min(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga376a6835981117634436f321b2ce2a92',1,'cv::cudev::min(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abd5ca68674510c6de74842959cfdc7',1,'cv::cudev::min(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb06294a2cfbb6069b757839c7fd9da',1,'cv::cudev::min(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ff980b4d39740767b63f1de88d1b57',1,'cv::cudev::min(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7df99230006a5cc5615b0011df7a36',1,'cv::cudev::min(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab249d89f99bb58dd18ca378c735a020',1,'cv::cudev::min(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0253aab8205cbcdfe6214ac2a69fe581',1,'cv::cudev::min(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520bff992e84829c710b2e09546fa22',1,'cv::cudev::min(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f2589513e2749a9851c4124646619b9',1,'cv::cudev::min(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5cbd2b6ca7192b0bd8e8495ef5159b8',1,'cv::cudev::min(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0488483f92053697cbcd087185945cf1',1,'cv::cudev::min(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01bddf9f2a64d5b3e53439be20d9c409',1,'cv::cudev::min(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfea1d9d44ed701c8e800349e04f23ee',1,'cv::cudev::min(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad80ae937fbf7a3dc21a6a6fa8180b099',1,'cv::cudev::min(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72e8042831b9697209fae75abf289835',1,'cv::cudev::min(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff909acfd57096f7c944766d1f65439',1,'cv::cudev::min(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga994dcac74e8ff3a0f53eec9f742c97da',1,'cv::cudev::min(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bf016e8bdbabc4af9fa4e017c17507e',1,'cv::cudev::min(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0e38244f6b1acb8682e3f85143bd492',1,'cv::cudev::min(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabba296ea279127cee978c2e3fb735522',1,'cv::cudev::min(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44e25ba04453413a2aefc32c98efd3d9',1,'cv::cudev::min(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga269a8ed52e0311c9346d987a756dc884',1,'cv::cudev::min(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3fda8022014b87c0102d0bbe0731809',1,'cv::cudev::min(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf44d7528016be23f9f4ef3a7da28bdac',1,'cv::cudev::min(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bcbc2bc3b592e71257b4ee668778787',1,'cv::cudev::min(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b2d8959b9f43f2bc2806dc0ec78a100',1,'cv::cudev::min(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f0ef4c14e25abea43ff8946afeafc8',1,'cv::cudev::min(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca8f4d79b4cc1dec4c909ecf5ccca6a6',1,'cv::cudev::min(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae92efcdaa0c6fab988a414451359851a',1,'cv::cudev::min(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24f7488a901b2674720f7a5126131e64',1,'cv::cudev::min(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11a1d2f321a3eeef5dc50189f5b2ae9e',1,'cv::cudev::min(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39261d4880c70eb9e3ef72458b4ac242',1,'cv::cudev::min(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9eb9db0ca15633cccfddb52a962b6f6f',1,'cv::cudev::min(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e93316cdeb4b820699835dc2c2451cd',1,'cv::cudev::min(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4a86c57c6faaa3c448c0f865a29b26',1,'cv::cudev::min(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3948d81d0bef9933acb0e62becdaebb1',1,'cv::cudev::min(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0eb3c2749a2fc4328bdf119d66c6bc4',1,'cv::cudev::min(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08f676bba98d6a2b2ff33bbb36c458ff',1,'cv::cudev::min(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70b3c38288b779b54682e86ad916fdac',1,'cv::cudev::min(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga165246f51a13bed7eab30ef17dcbc866',1,'cv::cudev::min(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51aaec59cc082c1de9ff5943f582b8a7',1,'cv::cudev::min(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad94786f5db09d1f9ee11cd46a3072e9d',1,'cv::cudev::min(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fbef402308aa4d0431e52e9e59043fc',1,'cv::cudev::min(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bd9efd0d4387ea02188f653b32660ca',1,'cv::cudev::min(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa933f0fd3d30808cb1b00cd3a39143b1',1,'cv::cudev::min(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d51422ef09b9121b7869ad2e5e5343d',1,'cv::cudev::min(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb37e86108df64988afff37c569bf1a',1,'cv::cudev::min(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd636d4ca9bfb329325255cf9471c0b',1,'cv::cudev::min(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4985add7084003b38bae25ce9b5eae2',1,'cv::cudev::min(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc007a2636b9d49e09c17caccca7b41e',1,'cv::cudev::min(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef22b25899d27ffa8f09721d1f5d8b01',1,'cv::cudev::min(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a8db4271fd8c29e4a9c986c8ffa2eb',1,'cv::cudev::min(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0adb3df57e4ce8523b76eb59fe026c1',1,'cv::cudev::min(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99455f76095aede9458911725660297',1,'cv::cudev::min(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06193d22fbddc873a3062371b1854d71',1,'cv::cudev::min(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39835721b56a82de6caea12b5ee0015f',1,'cv::cudev::min(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a9e0cefdaf6cb3661a2319e677167d1',1,'cv::cudev::min(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9376163743f15adf0f696ad00a5e96a2',1,'cv::cudev::min(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga684f17ba826938b730c28b1cf7e16970',1,'cv::cudev::min(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga245743829629cc8a53765790b8ef1433',1,'cv::cudev::min(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae70127cdf2e353258baef57e46ab4189',1,'cv::cudev::min(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf82c6bf26acf9096cd6f8d832e205a9e',1,'cv::cudev::min(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f990e7805334d097290763648fe0d15',1,'cv::cudev::min(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc89effe4a6e1877b214a90c228295fb',1,'cv::cudev::min(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac39cc5c8089033352304fecdb0c23a4a',1,'cv::cudev::min(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga609464e0f3eadb85eb02553bc55c966b',1,'cv::cudev::min(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d1edf16d076507bdeac3810ac34fea1',1,'cv::cudev::min(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6ff0c0ed6a04957c5ebfedd44429fa',1,'cv::cudev::min(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf850e4d7c3c2c5e301a444d81f97b0e9',1,'cv::cudev::min(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28fb416063c7287d74bd18444dbad517',1,'cv::cudev::min(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafac21d2fddb5266c56b94f0cd5060957',1,'cv::cudev::min(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafc4c9e25951034a070b138191a1646a',1,'cv::cudev::min(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a023347bfd7b017630d6396006c919e',1,'cv::cudev::min(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab395407fb935812dd1b2ebbba595861a',1,'cv::cudev::min(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8a6eebe9af1fab17cf91f2aeb54085b',1,'cv::cudev::min(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e644816e75c72b1f5514aa1c9a559f2',1,'cv::cudev::min(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9233bc7f6b5a39cf9b548d268c878a5e',1,'cv::cudev::min(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6b7c35282b6fc4f731ca3c1a7675ed',1,'cv::cudev::min(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e3044507d9d9f6ea035c12e342bf4c4',1,'cv::cudev::min(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga712cbf6a3192826a28b292961344ec8b',1,'cv::cudev::min(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa757af15c28d5ece108f75b9d31303e2',1,'cv::cudev::min(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07de7b9863eb6866b8551688ab0cee91',1,'cv::cudev::min(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1abaccc6127e9ae108f715ea8ca240f',1,'cv::cudev::min(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b09d9c14fe356cdc8fa9e3a11ed35f9',1,'cv::cudev::min(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f99b55e3715d2f70934264240b9ea1a',1,'cv::cudev::min(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd5d53908ea8d992b7176d4f70bf2e1',1,'cv::cudev::min(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad65bb9c77829a24470594a1a06957a1d',1,'cv::cudev::min(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeadc2b477ffa2ba5629c1eeca0b49d63',1,'cv::cudev::min(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41cae75d54fbbd09e25adb26e58458f3',1,'cv::cudev::min(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e5555ef897df48dc04fed27b35a519d',1,'cv::cudev::min(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63987f0c60443f7907a223a23429fa16',1,'cv::cudev::min(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaded7b15e951de4fec9096063ca51bf1b',1,'cv::cudev::min(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae55f0ba96bec14b409e1908032060a01',1,'cv::cudev::min(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71aea75a5c530a382493ca538b9b3018',1,'cv::cudev::min(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451f65567b74e7f92a5d0c1be7090e20',1,'cv::cudev::min(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga003b58a72697803ec951afece96b067c',1,'cv::cudev::min(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga533e7120fae1d8ebc4f464b5ad076ff2',1,'cv::cudev::min(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f8f3331bd8cdfd7d2d0146115910a6c',1,'cv::cudev::min(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b6dea62568edd9aa7cfc0b7ee379b2e',1,'cv::cudev::min(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a607b7403c4299e0c743e50d2f70a0f',1,'cv::cudev::min(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac96713804ac8f9c0be35643a2d6b38a0',1,'cv::cudev::min(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga706808dc4050b903da640de8dc4ce19c',1,'cv::cudev::min(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6d1a1c63011d0b7f43a55e5c867065',1,'cv::cudev::min(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaafdf291e5b12dd034c25a0700e380df',1,'cv::cudev::min(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac052d68d62664c6a829fcfc234b5ad2a',1,'cv::cudev::min(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76f6319d3c3b6aea1d9cfa7e08ec645b',1,'cv::cudev::min(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41aac042716daa83b5cdafd2896cb20e',1,'cv::cudev::min(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga505a34b8ad2b832c446adc4693575ec1',1,'cv::cudev::min(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd2121e8d2a8eb3c442170ce48b30b1',1,'cv::cudev::min(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42f5af056b00eca967153edcf7588cd',1,'cv::cudev::min(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eca6d43aa7825a5757bf5f7effa2c17',1,'cv::cudev::min(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b0dc3a4d4aa6124c3e507986d97dfa',1,'cv::cudev::min(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f1b5f9d9048faafff9fb2d71b48bc66',1,'cv::cudev::min(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74639cd57a08c6e6f002d67251dd6e9',1,'cv::cudev::min(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547a488ab3fd582ac967006d5d41f84b',1,'cv::cudev::min(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae52d65012143641cf97b730ecaf8b384',1,'cv::cudev::min(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5a7dace4270dd3ffb889566f1d4ca7',1,'cv::cudev::min(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bc085902b3894d4369dc5e90e5a7047',1,'cv::cudev::min(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd9203fd6fc69c27d18f0a6dab04cdde',1,'cv::cudev::min(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c6bbe4f5e2d46c15d0276414176ce5a',1,'cv::cudev::min(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e73fe37dc5804eb6fa06a2cb784d929',1,'cv::cudev::min(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d0256b15a322a01a295af1227b210d0',1,'cv::cudev::min(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ec000596d80b26bd3b935fc9f510579',1,'cv::cudev::min(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9b38519d19d3122a8a167758e380ed',1,'cv::cudev::min(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gab714c7a4adc847d75bfc080ac92924f4',1,'cv::gapi::min()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9af368f182ee76d0463d0d8d5330b764',1,'min(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0b8852cd1a92366860e390e8abbe78dc',1,'min(const Mat &src1, const Mat &src2, Mat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa83bf3dce9a4a488675347fff6692cb9',1,'min(const UMat &src1, const UMat &src2, UMat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga2473116e9ce9a101a7e6ed53753df9b6',1,'min()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac48df53b8fd34b87e7b121fa8fd4c379',1,'min(const softfloat &a, const softfloat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf625702f70e571f33784b0652be9a7b7',1,'min(const softdouble &a, const softdouble &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gab714c7a4adc847d75bfc080ac92924f4',1,'min(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga74f0b05a65b3d949c237abb5e6c60867',1,'min(InputArray src1, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166301154ec0c6fb8859c8126e013fac',1,'min(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37cfadd8b02bc1989b2ff264d915a6b',1,'min(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e7580e80893052d84dfb5ec5ca5f766',1,'min(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99931470f4d68820bbc5459ed795da8d',1,'min(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f515695538396fb8648b71901d058d',1,'min(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad2901b8dd9a2efa1ea3a075ddf2d3f8',1,'min(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga580140f65047fb3188cd74f2d0f69a08',1,'min(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf199b5514de7c6a6af1b2c73c5725b7b',1,'min(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa618ba2f3832b30d643cce7efa62a04c',1,'min(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c687dbc301bada436f1b666ac1ad4de',1,'min(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad638c54878b6ccf16f85915845369fb8',1,'min(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77ec7dd3c8bf8d93adb1a0ae89226dc0',1,'min(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68ba59a2fd07a335aa566788ae5b6dd8',1,'min(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga570aa1a8375e90a96942ba5a9d73a8b9',1,'min(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c5a8171954561ee7d86bad9a5b69ca',1,'min(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d89f72aa99839fa446920cee353de8',1,'min(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad897218ccbbb0e9cc8660213479afad2',1,'min(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga211f9a750f17f04c671e1ecff782d3b0',1,'min(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga534ff33d0fb6a9f231c45e11ec109c06',1,'min(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76547c7e7ce1e38e4bfbc95c41f211a9',1,'min(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f48115719f2492736e6c1e6e54b47bc',1,'min(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea84f0591c4aa8110ee233fd83f3b2e7',1,'min(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29bc62147e04bbc4d5cc713722b3ebc7',1,'min(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a27832d49d358b841977db8ac614fe',1,'min(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga874939daee476a502f9e25a60d11a0af',1,'min(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17b5b845d773a38304e10c6f6ef7a63b',1,'min(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40ba01d1818bae80a0b25cced8a91b0e',1,'min(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ea00427d284684a5381f925c8865413',1,'min(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e3b6cc4c9f631582962e2e8a570974',1,'min(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cbeba62c9983bec445ede74fe15c5d',1,'min(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a26ede9e7b8aff8af95843ae065a3d6',1,'min(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3b5b82737560408526a05e60a01cf0c',1,'min(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50b5e9c2bd4b51a9ca871a2affbab6be',1,'min(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bc7c6f847a6b03438d75ad28b20e50',1,'min(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5700161b6d3d48c4f6b6cb8f6893a77d',1,'min(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7e88fd0b276bc8f582117afba6f69b8',1,'min(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ebc299c55f1c956ba1bf59818339a9',1,'min(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490a5a4ee4b491ca52355d3591963d36',1,'min(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3deb31d4bd9746fe908aae0a32876a67',1,'min(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7443e024eba9d6e7dba462db0f87b09',1,'min(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f584667f590a24d7952bba2c38b9d38',1,'min(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fa8e7016286ff7a654d7f61c0b229ed',1,'min(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbdb0b1d874b4d611fbe2fc87aa6723e',1,'min(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25355dc07c2a9bcfe29dd47ffbd1af1f',1,'min(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga968ddc4b3f1330fd8bba47996a879279',1,'min(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00c88b38b31430626b18a806bab64102',1,'min(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01ef9f5f0c55a33ed31f61b8996a9ef2',1,'min(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b6e96bf59d8775fe468c8b0f0cd4c59',1,'min(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053670b49cc762f89cd71a48a23410b2',1,'min(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ae5c5fe2a9037803d26dc7ac9dc84e6',1,'min(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebde1cc8ab3c8a2489f018498b4af0e1',1,'min(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga328aabd669c55a39527628ca404d6d68',1,'min(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695465274932c09378b6c197485b592e',1,'min(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga428a2859cdb238bbbbf2fdb9215514bc',1,'min(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8c71d074f87253f2743bf2d51342f58',1,'min(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad695d4aa08dad8457dc787eb5b973397',1,'min(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0500af3d7867bfd51c3cad36ba0a491e',1,'min(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40714aaf703568f042ac2334279c96be',1,'min(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79fc45bfa8191d6dacaf6d791c8d657d',1,'min(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf2fc475cfe7c1829fa659aad92f5311',1,'min(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3311a28f02b9f7f2322042ba73793dc',1,'min(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga578896b54a57ff07a3bf7d0c3fd2543f',1,'min(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc186a6d010c07d69d9f2659f91f172',1,'min(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c0b1bc40a2ec46f6eb78af0a80253e',1,'min(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a838e528321de5c93cd881016818f4',1,'min(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae91887a3df27695bfac7c04a17e7f317',1,'min(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d81f05a2715d7b4869c831e948241f',1,'min(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ffc1aaa7e1fbf701e7c705005bbddb',1,'min(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1dccc25340fb0aaebd5570168f9523f',1,'min(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6db34e52d79cc78bb82d6473ed9d260b',1,'min(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d9172e56b98d1e9db062064c8871c2a',1,'min(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43a5a174cfe82f50b81cae0fef539eb2',1,'min(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a35bdd7cf565b9ade2b66e59bd0ed',1,'min(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f2de1cd74a26036c9655cac8f4fd12b',1,'min(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bbfbc5daa53d92b244b57ea9c7001b3',1,'min(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c0105c80bfe524779da1b354f6757e6',1,'min(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga376a6835981117634436f321b2ce2a92',1,'min(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abd5ca68674510c6de74842959cfdc7',1,'min(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb06294a2cfbb6069b757839c7fd9da',1,'min(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ff980b4d39740767b63f1de88d1b57',1,'min(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7df99230006a5cc5615b0011df7a36',1,'min(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab249d89f99bb58dd18ca378c735a020',1,'min(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0253aab8205cbcdfe6214ac2a69fe581',1,'min(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520bff992e84829c710b2e09546fa22',1,'min(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f2589513e2749a9851c4124646619b9',1,'min(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5cbd2b6ca7192b0bd8e8495ef5159b8',1,'min(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0488483f92053697cbcd087185945cf1',1,'min(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01bddf9f2a64d5b3e53439be20d9c409',1,'min(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfea1d9d44ed701c8e800349e04f23ee',1,'min(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad80ae937fbf7a3dc21a6a6fa8180b099',1,'min(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72e8042831b9697209fae75abf289835',1,'min(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff909acfd57096f7c944766d1f65439',1,'min(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga994dcac74e8ff3a0f53eec9f742c97da',1,'min(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bf016e8bdbabc4af9fa4e017c17507e',1,'min(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0e38244f6b1acb8682e3f85143bd492',1,'min(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabba296ea279127cee978c2e3fb735522',1,'min(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44e25ba04453413a2aefc32c98efd3d9',1,'min(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga269a8ed52e0311c9346d987a756dc884',1,'min(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3fda8022014b87c0102d0bbe0731809',1,'min(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf44d7528016be23f9f4ef3a7da28bdac',1,'min(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bcbc2bc3b592e71257b4ee668778787',1,'min(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b2d8959b9f43f2bc2806dc0ec78a100',1,'min(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f0ef4c14e25abea43ff8946afeafc8',1,'min(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca8f4d79b4cc1dec4c909ecf5ccca6a6',1,'min(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae92efcdaa0c6fab988a414451359851a',1,'min(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24f7488a901b2674720f7a5126131e64',1,'min(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11a1d2f321a3eeef5dc50189f5b2ae9e',1,'min(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39261d4880c70eb9e3ef72458b4ac242',1,'min(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9eb9db0ca15633cccfddb52a962b6f6f',1,'min(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e93316cdeb4b820699835dc2c2451cd',1,'min(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4a86c57c6faaa3c448c0f865a29b26',1,'min(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3948d81d0bef9933acb0e62becdaebb1',1,'min(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0eb3c2749a2fc4328bdf119d66c6bc4',1,'min(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08f676bba98d6a2b2ff33bbb36c458ff',1,'min(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70b3c38288b779b54682e86ad916fdac',1,'min(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga165246f51a13bed7eab30ef17dcbc866',1,'min(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51aaec59cc082c1de9ff5943f582b8a7',1,'min(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad94786f5db09d1f9ee11cd46a3072e9d',1,'min(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fbef402308aa4d0431e52e9e59043fc',1,'min(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bd9efd0d4387ea02188f653b32660ca',1,'min(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa933f0fd3d30808cb1b00cd3a39143b1',1,'min(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d51422ef09b9121b7869ad2e5e5343d',1,'min(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb37e86108df64988afff37c569bf1a',1,'min(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd636d4ca9bfb329325255cf9471c0b',1,'min(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4985add7084003b38bae25ce9b5eae2',1,'min(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc007a2636b9d49e09c17caccca7b41e',1,'min(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef22b25899d27ffa8f09721d1f5d8b01',1,'min(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a8db4271fd8c29e4a9c986c8ffa2eb',1,'min(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0adb3df57e4ce8523b76eb59fe026c1',1,'min(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99455f76095aede9458911725660297',1,'min(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06193d22fbddc873a3062371b1854d71',1,'min(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39835721b56a82de6caea12b5ee0015f',1,'min(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a9e0cefdaf6cb3661a2319e677167d1',1,'min(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9376163743f15adf0f696ad00a5e96a2',1,'min(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga684f17ba826938b730c28b1cf7e16970',1,'min(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga245743829629cc8a53765790b8ef1433',1,'min(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae70127cdf2e353258baef57e46ab4189',1,'min(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf82c6bf26acf9096cd6f8d832e205a9e',1,'min(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f990e7805334d097290763648fe0d15',1,'min(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc89effe4a6e1877b214a90c228295fb',1,'min(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac39cc5c8089033352304fecdb0c23a4a',1,'min(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga609464e0f3eadb85eb02553bc55c966b',1,'min(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d1edf16d076507bdeac3810ac34fea1',1,'min(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6ff0c0ed6a04957c5ebfedd44429fa',1,'min(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf850e4d7c3c2c5e301a444d81f97b0e9',1,'min(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28fb416063c7287d74bd18444dbad517',1,'min(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafac21d2fddb5266c56b94f0cd5060957',1,'min(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafc4c9e25951034a070b138191a1646a',1,'min(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a023347bfd7b017630d6396006c919e',1,'min(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab395407fb935812dd1b2ebbba595861a',1,'min(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8a6eebe9af1fab17cf91f2aeb54085b',1,'min(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e644816e75c72b1f5514aa1c9a559f2',1,'min(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9233bc7f6b5a39cf9b548d268c878a5e',1,'min(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6b7c35282b6fc4f731ca3c1a7675ed',1,'min(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e3044507d9d9f6ea035c12e342bf4c4',1,'min(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga712cbf6a3192826a28b292961344ec8b',1,'min(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa757af15c28d5ece108f75b9d31303e2',1,'min(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07de7b9863eb6866b8551688ab0cee91',1,'min(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1abaccc6127e9ae108f715ea8ca240f',1,'min(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b09d9c14fe356cdc8fa9e3a11ed35f9',1,'min(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f99b55e3715d2f70934264240b9ea1a',1,'min(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd5d53908ea8d992b7176d4f70bf2e1',1,'min(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad65bb9c77829a24470594a1a06957a1d',1,'min(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeadc2b477ffa2ba5629c1eeca0b49d63',1,'min(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41cae75d54fbbd09e25adb26e58458f3',1,'min(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e5555ef897df48dc04fed27b35a519d',1,'min(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63987f0c60443f7907a223a23429fa16',1,'min(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaded7b15e951de4fec9096063ca51bf1b',1,'min(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae55f0ba96bec14b409e1908032060a01',1,'min(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71aea75a5c530a382493ca538b9b3018',1,'min(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451f65567b74e7f92a5d0c1be7090e20',1,'min(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga003b58a72697803ec951afece96b067c',1,'min(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga533e7120fae1d8ebc4f464b5ad076ff2',1,'min(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f8f3331bd8cdfd7d2d0146115910a6c',1,'min(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b6dea62568edd9aa7cfc0b7ee379b2e',1,'min(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a607b7403c4299e0c743e50d2f70a0f',1,'min(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac96713804ac8f9c0be35643a2d6b38a0',1,'min(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga706808dc4050b903da640de8dc4ce19c',1,'min(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6d1a1c63011d0b7f43a55e5c867065',1,'min(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaafdf291e5b12dd034c25a0700e380df',1,'min(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac052d68d62664c6a829fcfc234b5ad2a',1,'min(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76f6319d3c3b6aea1d9cfa7e08ec645b',1,'min(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41aac042716daa83b5cdafd2896cb20e',1,'min(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga505a34b8ad2b832c446adc4693575ec1',1,'min(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd2121e8d2a8eb3c442170ce48b30b1',1,'min(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42f5af056b00eca967153edcf7588cd',1,'min(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eca6d43aa7825a5757bf5f7effa2c17',1,'min(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b0dc3a4d4aa6124c3e507986d97dfa',1,'min(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f1b5f9d9048faafff9fb2d71b48bc66',1,'min(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74639cd57a08c6e6f002d67251dd6e9',1,'min(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547a488ab3fd582ac967006d5d41f84b',1,'min(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae52d65012143641cf97b730ecaf8b384',1,'min(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5a7dace4270dd3ffb889566f1d4ca7',1,'min(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bc085902b3894d4369dc5e90e5a7047',1,'min(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd9203fd6fc69c27d18f0a6dab04cdde',1,'min(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c6bbe4f5e2d46c15d0276414176ce5a',1,'min(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e73fe37dc5804eb6fa06a2cb784d929',1,'min(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d0256b15a322a01a295af1227b210d0',1,'min(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ec000596d80b26bd3b935fc9f510579',1,'min(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9b38519d19d3122a8a167758e380ed',1,'min(const double3 &a, double s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a694c714713cacc857e126157b5472448',1,'__gnu_parallel::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gad48656de2f272a953455e1fff2532125',1,'std::min(const _Tp &__a, const _Tp &__b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6499dc0f7db12560643a3b79db5357f6',1,'std::min(const _Tp &__a, const _Tp &__b, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41cf9f2fac24470499589628f657be67',1,'min() const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gad48656de2f272a953455e1fff2532125',1,'min(const _Tp &__a, const _Tp &__b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6499dc0f7db12560643a3b79db5357f6',1,'min(const _Tp &__a, const _Tp &__b, _Compare __comp)(Global Namespace)']]], - ['min16s_760',['min16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae83e8c8c49856c8ff27464a5db0d9675',1,'cv::hal::min16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae83e8c8c49856c8ff27464a5db0d9675',1,'min16s()(Global Namespace)']]], - ['min16u_761',['min16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga335e895c38ac1eb36c369be486da8153',1,'cv::hal::min16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga335e895c38ac1eb36c369be486da8153',1,'min16u()(Global Namespace)']]], - ['min32f_762',['min32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf5f3e8331a257006805cc99669177886',1,'cv::hal::min32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf5f3e8331a257006805cc99669177886',1,'min32f()(Global Namespace)']]], - ['min32s_763',['min32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5700a944987bea8f8b1d690bef9ddb86',1,'cv::hal::min32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5700a944987bea8f8b1d690bef9ddb86',1,'min32s()(Global Namespace)']]], - ['min64f_764',['min64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1dfb30bfd99e7ec82e403ac1d2ba564',1,'cv::hal::min64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1dfb30bfd99e7ec82e403ac1d2ba564',1,'min64f()(Global Namespace)']]], - ['min8s_765',['min8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga776e806b44d419b8fe1aeeb0edc33b19',1,'cv::hal::min8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga776e806b44d419b8fe1aeeb0edc33b19',1,'min8s()(Global Namespace)']]], - ['min8u_766',['min8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga728aef20afc83e88001bf555e5375820',1,'cv::hal::min8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga728aef20afc83e88001bf555e5375820',1,'min8u()(Global Namespace)']]], - ['min_5f_767',['min_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03ebd56c9351013f5bb957a585f7137',1,'cv::cudev::min_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03ebd56c9351013f5bb957a585f7137',1,'min_()(Global Namespace)']]], - ['min_5fapi_5fversion_768',['min_api_version',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#a9ff1dcbcd3b842ec86114f556a38ad8a',1,'OpenCV_API_Header']]], - ['min_5fdet_5fconf_769',['min_det_conf',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#aa0e43d74962bb777b1ab22be1e8e2616',1,'cv::tbm::TrackerParams']]], - ['min_5felement_770',['min_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga1de5df2bd9b3d6e5716e82c95ae6df2a',1,'std::min_element(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaef494344047573854d8e2d34070fd2b4',1,'std::min_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga1de5df2bd9b3d6e5716e82c95ae6df2a',1,'min_element(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaef494344047573854d8e2d34070fd2b4',1,'min_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], - ['min_5felement_5fminimal_5fn_771',['min_element_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#aa85f76a1f1bfd6c87efed32062222a05',1,'__gnu_parallel::_Settings']]], - ['min_5fexponent_772',['min_exponent',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a2552b13ee696d6a61a0a037fef1dc1e0',1,'std::__numeric_limits_base::min_exponent'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a2552b13ee696d6a61a0a037fef1dc1e0',1,'std::numeric_limits::min_exponent']]], - ['min_5fexponent10_773',['min_exponent10',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ad10027037371bb1138225df2876d5e6c',1,'std::__numeric_limits_base::min_exponent10'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ad10027037371bb1138225df2876d5e6c',1,'std::numeric_limits::min_exponent10']]], - ['min_5fprobability_5fancestor_774',['min_probability_ancestor',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#aaec3c9b6265724b67ebe16d24ddacd06',1,'cv::text::ERStat']]], - ['min_5ftrack_5fduration_775',['min_track_duration',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#ab694f386f8bbdd3a40e7b19b96bf45c2',1,'cv::tbm::TrackerParams']]], - ['minarea_776',['minArea',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#ace988d1613ed46c43458d04780634300',1,'cv::cuda::FGDParams::minArea'],['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a6a6c9c6120a771a5775578d7fdb72f17',1,'cv::SimpleBlobDetector::Params::minArea']]], - ['minarearect_777',['minAreaRect',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga3d476a3417130ae5154aea421ca7ead9',1,'cv::minAreaRect()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga3d476a3417130ae5154aea421ca7ead9',1,'minAreaRect()(Global Namespace)']]], - ['mincircularity_778',['minCircularity',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#aabf6e03342ba75e3cb7b1ba624f68793',1,'cv::SimpleBlobDetector::Params']]], - ['mincoeff_779',['minCoeff',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'Eigen::DenseBase::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'Eigen::DenseBase::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'Eigen::DenseBase::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'DenseBase< ArrayWrapper< ExpressionType > >::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'DenseBase< ArrayWrapper< ExpressionType > >::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'DenseBase< ArrayWrapper< ExpressionType > >::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'DenseBase< Solve< Decomposition, RhsType > >::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'DenseBase< Solve< Decomposition, RhsType > >::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'DenseBase< Solve< Decomposition, RhsType > >::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'Eigen::VectorwiseOp::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Derived, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Derived, Vertical >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::minCoeff()']]], - ['minconvexity_780',['minConvexity',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a9f8137228ba6eea83814d21ad2b3f97d',1,'cv::SimpleBlobDetector::Params']]], - ['mincornerdistancerate_781',['minCornerDistanceRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a7966579df6a68388a45973533b3cd054',1,'cv::aruco::DetectorParameters']]], - ['mindensity_782',['minDensity',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a5d3f633ba3a4734bb5285bd7470e0c25',1,'cv::CirclesGridFinderParameters']]], - ['mindepth_783',['minDepth',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a5a5770574b40555feff550b22efa705b',1,'cv::rgbd::ICPOdometry::minDepth'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a857d420228833e27aa87e156d5721789',1,'cv::rgbd::RgbdICPOdometry::minDepth'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#ac3250a3a00edafd9543946682b5309cd',1,'cv::rgbd::RgbdOdometry::minDepth']]], - ['mindetectionperiod_784',['minDetectionPeriod',['https://docs.opencv.org/4.2.0/d4/d80/structcv_1_1DetectionBasedTracker_1_1Parameters.html#a50a8e00de9157289123f09e7cd1d445f',1,'cv::DetectionBasedTracker::Parameters']]], - ['mindistancetoaddkeypoint_785',['minDistanceToAddKeypoint',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a89e644f5ed6c6a20ff6f920774d76baf',1,'cv::CirclesGridFinderParameters']]], - ['mindistancetoborder_786',['minDistanceToBorder',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a93e8229b7d7db81984eb32ef4c1d1f3f',1,'cv::aruco::DetectorParameters']]], - ['mindistbetweenblobs_787',['minDistBetweenBlobs',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#afd39dd0969c6549d00afb45beade6f0c',1,'cv::SimpleBlobDetector::Params']]], - ['mineigenvalue_788',['minEigenValue',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a1ad23a84fddee00611744b5e57a73cf0',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['minenclosingcircle_789',['minEnclosingCircle',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8ce13c24081bbc7151e9326f412190f1',1,'cv::minEnclosingCircle()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8ce13c24081bbc7151e9326f412190f1',1,'minEnclosingCircle()(Global Namespace)']]], - ['minenclosingtriangle_790',['minEnclosingTriangle',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga1513e72f6bbdfc370563664f71e0542f',1,'cv::minEnclosingTriangle()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga1513e72f6bbdfc370563664f71e0542f',1,'minEnclosingTriangle()(Global Namespace)']]], - ['mingradientmagnitudes_791',['minGradientMagnitudes',['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a236858a9cbaeffcc414b67746884b31d',1,'cv::rgbd::RgbdICPOdometry::minGradientMagnitudes'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a0ba69387535fcf5bb4fca8b6400c01b0',1,'cv::rgbd::RgbdOdometry::minGradientMagnitudes']]], - ['mingraphconfidence_792',['minGraphConfidence',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a566ef85146c08345fe399dfaa4e8a786',1,'cv::CirclesGridFinderParameters']]], - ['mini_5fbatch_793',['MINI_BATCH',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a11394898c4732995dd3af8a665f92894aabdf956ee52b567744e53767d0f41df1',1,'cv::ml::LogisticRegression']]], - ['miniflann_2ehpp_794',['miniflann.hpp',['https://docs.opencv.org/4.2.0/da/dfe/miniflann_8hpp.html',1,'']]], - ['minimize_795',['minimize',['https://docs.opencv.org/4.2.0/df/d11/classcv_1_1MinProblemSolver.html#ade85ab8dceca1ee4974f62b758fa90af',1,'cv::MinProblemSolver']]], - ['minimum_796',['minimum',['https://docs.opencv.org/4.2.0/d5/dc9/structcv_1_1cudev_1_1minimum.html',1,'cv::cudev']]], - ['minimum_20or_20maximum_797',['Element-wise minimum or maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'']]], - ['minimum_3c_20double_20_3e_798',['minimum< double >',['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1minimum_3_01double_01_4.html',1,'cv::cudev']]], - ['minimum_3c_20float_20_3e_799',['minimum< float >',['https://docs.opencv.org/4.2.0/d1/d9d/structcv_1_1cudev_1_1minimum_3_01float_01_4.html',1,'cv::cudev']]], - ['minimum_3c_20schar_20_3e_800',['minimum< schar >',['https://docs.opencv.org/4.2.0/d5/d75/structcv_1_1cudev_1_1minimum_3_01schar_01_4.html',1,'cv::cudev']]], - ['minimum_3c_20short_20_3e_801',['minimum< short >',['https://docs.opencv.org/4.2.0/db/d5b/structcv_1_1cudev_1_1minimum_3_01short_01_4.html',1,'cv::cudev']]], - ['minimum_3c_20uchar_20_3e_802',['minimum< uchar >',['https://docs.opencv.org/4.2.0/d8/d48/structcv_1_1cudev_1_1minimum_3_01uchar_01_4.html',1,'cv::cudev']]], - ['minimum_3c_20uint_20_3e_803',['minimum< uint >',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1cudev_1_1minimum_3_01uint_01_4.html',1,'cv::cudev']]], - ['minimum_3c_20ushort_20_3e_804',['minimum< ushort >',['https://docs.opencv.org/4.2.0/de/dfa/structcv_1_1cudev_1_1minimum_3_01ushort_01_4.html',1,'cv::cudev']]], - ['mininertiaratio_805',['minInertiaRatio',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a7494ba01e46a71f75325f3142ff5d307',1,'cv::SimpleBlobDetector::Params']]], - ['mininlierratio_806',['minInlierRatio',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#a7601c6c793bbb8337f0de8526339c8af',1,'cv::videostab::MotionEstimatorRansacL2']]], - ['minmarkerdistancerate_807',['minMarkerDistanceRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a28b4eb55fe68292541e4272edc4fde86',1,'cv::aruco::DetectorParameters']]], - ['minmarkerperimeterrate_808',['minMarkerPerimeterRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#ad0a7fadbc6f9453e4d3777355dcafd51',1,'cv::aruco::DetectorParameters']]], - ['minmax_809',['minMax',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga8d7de68c10717cf25e787e3c20d2dfee',1,'cv::cuda::minMax()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga8d7de68c10717cf25e787e3c20d2dfee',1,'minMax()(Global Namespace)']]], - ['minmax_810',['minmax',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga67c7bf4c4b3c5cbf251a3812e06e0308',1,'std::minmax(const _Tp &__a, const _Tp &__b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga74c98df71fd53702699434040aacb249',1,'std::minmax(const _Tp &__a, const _Tp &__b, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga67c7bf4c4b3c5cbf251a3812e06e0308',1,'minmax(const _Tp &__a, const _Tp &__b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga74c98df71fd53702699434040aacb249',1,'minmax(const _Tp &__a, const _Tp &__b, _Compare __comp)(Global Namespace)']]], - ['minmax_5felement_811',['minmax_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabaec6cf28af83896d2253693d08d4cfe',1,'std::minmax_element(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaa8e6bf20463e0f605a548e7d7efb099d',1,'std::minmax_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabaec6cf28af83896d2253693d08d4cfe',1,'minmax_element(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaa8e6bf20463e0f605a548e7d7efb099d',1,'minmax_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], - ['minmaxidx_812',['minMaxIdx',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7622c466c628a75d9ed008b42250a73f',1,'cv::minMaxIdx()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7622c466c628a75d9ed008b42250a73f',1,'minMaxIdx()(Global Namespace)']]], - ['minmaxloc_813',['minMaxLoc',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab473bf2eb6d14ff97e89b355dac20707',1,'cv::minMaxLoc(InputArray src, double *minVal, double *maxVal=0, Point *minLoc=0, Point *maxLoc=0, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8873b86a29c5af51cafdcee82f8150a7',1,'cv::minMaxLoc(const SparseMat &a, double *minVal, double *maxVal, int *minIdx=0, int *maxIdx=0)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga5cacbc2a2323c4eaa81e7390c5d9f530',1,'cv::cuda::minMaxLoc()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab473bf2eb6d14ff97e89b355dac20707',1,'minMaxLoc(InputArray src, double *minVal, double *maxVal=0, Point *minLoc=0, Point *maxLoc=0, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8873b86a29c5af51cafdcee82f8150a7',1,'minMaxLoc(const SparseMat &a, double *minVal, double *maxVal, int *minIdx=0, int *maxIdx=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga5cacbc2a2323c4eaa81e7390c5d9f530',1,'minMaxLoc(InputArray src, double *minVal, double *maxVal, Point *minLoc, Point *maxLoc, InputArray mask=noArray())(Global Namespace)']]], - ['minmaxval_5f_814',['minMaxVal_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf18a35345e39d8e38a32d6396e30a8e',1,'cv::cudev::minMaxVal_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf18a35345e39d8e38a32d6396e30a8e',1,'minMaxVal_()(Global Namespace)']]], - ['minneighbors_815',['minNeighbors',['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html#a18c96f625bbb7dacf4246f9c867eac0b',1,'cv::face::CParams']]], - ['minneighbours_816',['minNeighbours',['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#a8ef03c2f2a5d822ef686d119a2800212',1,'cv::DetectionBasedTracker::IDetector']]], - ['minnumberofsamples_817',['minNumberOfSamples',['https://docs.opencv.org/4.2.0/d1/dcc/structcv_1_1optflow_1_1GPCTrainingParams.html#a2168707bcbf42324cbbc108591e835a6',1,'cv::optflow::GPCTrainingParams']]], - ['minobjsize_818',['minObjSize',['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#af89dbb1102becacb1bfae95069ab1bfc',1,'cv::DetectionBasedTracker::IDetector']]], - ['minorversion_819',['minorVersion',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a2dfd3373e10731b54083ebd415009679',1,'cv::cuda::DeviceInfo']]], - ['minotsustddev_820',['minOtsuStdDev',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#aefb84a734bdcc918e54bb2ff4f17f2f4',1,'cv::aruco::DetectorParameters']]], - ['minproblemsolver_821',['MinProblemSolver',['https://docs.opencv.org/4.2.0/df/d11/classcv_1_1MinProblemSolver.html',1,'cv']]], - ['minrepeatability_822',['minRepeatability',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a5fdde080e684655ad634a3be4fb52888',1,'cv::SimpleBlobDetector::Params']]], - ['minres_823',['minRes',['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#ae2122575355f297a10d33a9048c743fb',1,'cv::face::StandardCollector']]], - ['minrngedgeswitchdist_824',['minRNGEdgeSwitchDist',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#adc90e952bce24f63383a8c3c94c4b753',1,'cv::CirclesGridFinderParameters']]], - ['minsize_825',['minSize',['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html#a2511bab04817f942b7c2789e5e86159b',1,'cv::face::CParams']]], - ['minstd_5frand_826',['minstd_rand',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga06944ee85abb11c4d8332728514da20a',1,'std::minstd_rand'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga06944ee85abb11c4d8332728514da20a',1,'minstd_rand(Global Namespace)']]], - ['minstd_5frand0_827',['minstd_rand0',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga70e14a580880f05e94a51c6e103e1cd1',1,'std::minstd_rand0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga70e14a580880f05e94a51c6e103e1cd1',1,'minstd_rand0(Global Namespace)']]], - ['minthreshold_828',['minThreshold',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a6e749132c0e8702f3a7289986572bfff',1,'cv::SimpleBlobDetector::Params']]], - ['minus_829',['minus',['https://docs.opencv.org/4.2.0/da/df1/structcv_1_1cudev_1_1minus.html',1,'cv::cudev::minus< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07359.html',1,'std::minus< class >']]], - ['minus_830',['MINUS',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#ac72268153bf12925f601c4defe7d5e50ae4c8b209454fa9578ddb3af45da854c2',1,'cv::xfeatures2d::PCTSignatures']]], - ['minus_3c_20void_20_3e_831',['minus< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07383.html',1,'std']]], - ['minusdelta_832',['minusDelta',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#ad8c1822684034533a52969c837e5f96c',1,'cv::LineIterator']]], - ['minusstep_833',['minusStep',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a293eafffedcac965ae5d7fb7fc8d8345',1,'cv::LineIterator']]], - ['minutes_834',['minutes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#ab797381ce4735af1cb63ecde984ba94c',1,'std::chrono']]], - ['minval_835',['minVal',['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a7ce2f9514d5e05b99c325627dbbcba09',1,'cv::ml::ParamGrid']]], - ['minval_5f_836',['minVal_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba7fa397fed60ac4af5595a4dce4d92a',1,'cv::cudev::minVal_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba7fa397fed60ac4af5595a4dce4d92a',1,'minVal_()(Global Namespace)']]], - ['minvalue_837',['minValue',['https://docs.opencv.org/4.2.0/dc/dcd/classcv_1_1dnn_1_1ReLU6Layer.html#aa200bc4e9f9a501a47e881276631707f',1,'cv::dnn::ReLU6Layer']]], - ['miscellaneous_20image_20transformations_838',['Miscellaneous Image Transformations',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html',1,'']]], - ['mishlayer_839',['MishLayer',['https://docs.opencv.org/4.2.0/d4/da1/classcv_1_1dnn_1_1MishLayer.html',1,'cv::dnn']]], - ['mismatch_840',['mismatch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga44ee120346d18fb398be3891eb4a8c0c',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad3cb7460f4803c1073882c89456bb75c',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga67d3e43b97d25f32dd1661a93aa85ff1',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga07f5690e64fb9ece316f84ec99c28e5d',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga44ee120346d18fb398be3891eb4a8c0c',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad3cb7460f4803c1073882c89456bb75c',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _BinaryPredicate __binary_pred)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga67d3e43b97d25f32dd1661a93aa85ff1',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga07f5690e64fb9ece316f84ec99c28e5d',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _BinaryPredicate __binary_pred)(Global Namespace)']]], - ['miss_841',['Hit-or-Miss',['https://docs.opencv.org/4.2.0/db/d06/tutorial_hitOrMiss.html',1,'']]], - ['missingvalue_842',['missingValue',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#a852e02da238303d33fd5923b75657584',1,'cv::ml::TrainData']]], - ['missioncontrolprotocol_843',['MissionControlProtocol',['../classnet_1_1mc_1_1MissionControlProtocol.html',1,'net::mc']]], - ['mixchannels_844',['mixChannels',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga51d768c270a1cdd3497255017c4504be',1,'cv::mixChannels(const Mat *src, size_t nsrcs, Mat *dst, size_t ndsts, const int *fromTo, size_t npairs)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga89dd05fd8fe54f5b7b5d89bca21153a1',1,'cv::mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const int *fromTo, size_t npairs)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga83b61f9875e6618ee08487b21ec71ab1',1,'cv::mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const std::vector< int > &fromTo)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga51d768c270a1cdd3497255017c4504be',1,'mixChannels(const Mat *src, size_t nsrcs, Mat *dst, size_t ndsts, const int *fromTo, size_t npairs)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga89dd05fd8fe54f5b7b5d89bca21153a1',1,'mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const int *fromTo, size_t npairs)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga83b61f9875e6618ee08487b21ec71ab1',1,'mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const std::vector< int > &fromTo)(Global Namespace)']]], - ['mixed_5fclone_845',['MIXED_CLONE',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca9aeff931a5d5d18b094397f0ca5bb85f',1,'cv::MIXED_CLONE'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca9aeff931a5d5d18b094397f0ca5bb85f',1,'MIXED_CLONE(Global Namespace)']]], - ['mjpeg_846',['MJPEG',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a9104e3711964b4e7723bab15987f41b9a90aee40e0bad141df3ded65876999d74',1,'cv']]], - ['mkl_20from_20eigen_847',['Using Intel® MKL from Eigen',['https://eigen.tuxfamily.org/dox/TopicUsingIntelMKL.html',1,'']]], - ['mkview_848',['mkView',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a6f0fc00343ffd3e22573d85864785f39',1,'cv::gapi::fluid::Buffer']]], - ['ml_20module_849',['Machine Learning (ml module)',['https://docs.opencv.org/4.2.0/d1/d69/tutorial_table_of_content_ml.html',1,'']]], - ['ml_2ehpp_850',['ml.hpp',['https://docs.opencv.org/4.2.0/df/d5c/ml_2ml_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d29/ml_8hpp.html',1,'(Global Namespace)']]], - ['ml_5fintro_2emarkdown_851',['ml_intro.markdown',['https://docs.opencv.org/4.2.0/db/df6/ml__intro_8markdown.html',1,'']]], - ['mlab_852',['mlab',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1aa89085077df1acc691a2f02f39cefd',1,'cv::viz::Color']]], - ['mm_5faffine_853',['MM_AFFINE',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a30b3b23d3cdd42fd8a7c4e286472de36',1,'cv::videostab::MM_AFFINE'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a30b3b23d3cdd42fd8a7c4e286472de36',1,'MM_AFFINE(Global Namespace)']]], - ['mm_5fhomography_854',['MM_HOMOGRAPHY',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a3071d1039ef9d542486f51a864134fb2',1,'cv::videostab::MM_HOMOGRAPHY'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a3071d1039ef9d542486f51a864134fb2',1,'MM_HOMOGRAPHY(Global Namespace)']]], - ['mm_5frigid_855',['MM_RIGID',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a633545fdfe3273bb79ce349f79a1383c',1,'cv::videostab::MM_RIGID'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a633545fdfe3273bb79ce349f79a1383c',1,'MM_RIGID(Global Namespace)']]], - ['mm_5frotation_856',['MM_ROTATION',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a2765d1659d5a36bdd1c356396a624ae1',1,'cv::videostab::MM_ROTATION'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a2765d1659d5a36bdd1c356396a624ae1',1,'MM_ROTATION(Global Namespace)']]], - ['mm_5fsimilarity_857',['MM_SIMILARITY',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a1aca015a89be32663e700279ed2380f5',1,'cv::videostab::MM_SIMILARITY'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a1aca015a89be32663e700279ed2380f5',1,'MM_SIMILARITY(Global Namespace)']]], - ['mm_5ftranslation_858',['MM_TRANSLATION',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1ad150f24197611b08a99e45c5a93ef264',1,'cv::videostab::MM_TRANSLATION'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1ad150f24197611b08a99e45c5a93ef264',1,'MM_TRANSLATION(Global Namespace)']]], - ['mm_5ftranslation_5fand_5fscale_859',['MM_TRANSLATION_AND_SCALE',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a3d76e30fb2c762645cbd8c83b2d4d556',1,'cv::videostab::MM_TRANSLATION_AND_SCALE'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a3d76e30fb2c762645cbd8c83b2d4d556',1,'MM_TRANSLATION_AND_SCALE(Global Namespace)']]], - ['mm_5funknown_860',['MM_UNKNOWN',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a3354f345c38aa36dbf97cc17639bf9c2',1,'cv::videostab::MM_UNKNOWN'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a3354f345c38aa36dbf97cc17639bf9c2',1,'MM_UNKNOWN(Global Namespace)']]], - ['mod_5fbased_5frange_5fhashing_861',['mod_based_range_hashing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11739.html',1,'__gnu_pbds::detail']]], - ['mod_5fbased_5frange_5fhashing_2ehpp_862',['mod_based_range_hashing.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01322.html',1,'']]], - ['modalities_863',['modalities',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a4e4080b2f211294fc79c55aa11654c2c',1,'cv::linemod::Detector']]], - ['modality_864',['Modality',['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html',1,'cv::linemod']]], - ['mode_865',['MODE',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#a2a97c5b832651524b8e782496b933d45',1,'cv::TrackerKCF']]], - ['mode_866',['mode',['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#af346c7c2d406ca2e05dcea11dcf39f24',1,'cv::text::OCRBeamSearchDecoder::mode'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a5776dd855966c99a8c15a7ab04bbcd81',1,'cv::text::OCRHMMDecoder::mode']]], - ['mode_867',['Mode',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482d',1,'cv::FileStorage::Mode'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a114713924ec05a0309f4df7e918c0324',1,'cv::Stitcher::Mode']]], - ['mode_5fclassify_868',['MODE_CLASSIFY',['https://docs.opencv.org/4.2.0/da/d3e/classcv_1_1TrackerSamplerCS.html#aa2224018a9802276b72810519752d770af87b7e1485da44104523f6063cef6e73',1,'cv::TrackerSamplerCS']]], - ['mode_5fdetect_869',['MODE_DETECT',['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#a2834448d2e780fea900ec7fefae1a138ab73351032c3072cf2acede25f4c68125',1,'cv::TrackerSamplerCSC']]], - ['mode_5fhh_870',['MODE_HH',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a2b29581546f96316b38d85b6d444addea63b8637d8c69a830927c267b3b4ce5a7',1,'cv::stereo::StereoBinarySGBM::MODE_HH'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ada549f34c6f030a64d3a1d2f364b547ba0f746667febe92e1189e924c40752660',1,'cv::StereoSGBM::MODE_HH']]], - ['mode_5fhh4_871',['MODE_HH4',['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ada549f34c6f030a64d3a1d2f364b547ba2bb93a960b8709039f81d7027b928559',1,'cv::StereoSGBM']]], - ['mode_5finit_5fneg_872',['MODE_INIT_NEG',['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#a2834448d2e780fea900ec7fefae1a138a699e67504963c1ef7adf3978098232dd',1,'cv::TrackerSamplerCSC']]], - ['mode_5finit_5fpos_873',['MODE_INIT_POS',['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#a2834448d2e780fea900ec7fefae1a138a256c577d2c2e5c157d3e6c90424498e8',1,'cv::TrackerSamplerCSC']]], - ['mode_5fnegative_874',['MODE_NEGATIVE',['https://docs.opencv.org/4.2.0/da/d3e/classcv_1_1TrackerSamplerCS.html#aa2224018a9802276b72810519752d770adbffdf4fa17dc363046362e2395ada38',1,'cv::TrackerSamplerCS']]], - ['mode_5fpositive_875',['MODE_POSITIVE',['https://docs.opencv.org/4.2.0/da/d3e/classcv_1_1TrackerSamplerCS.html#aa2224018a9802276b72810519752d770a6d9df662f3d423c95760db63f6b34479',1,'cv::TrackerSamplerCS']]], - ['mode_5fsgbm_876',['MODE_SGBM',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a2b29581546f96316b38d85b6d444addeac1cec4aa27cb3cdeae78a41e2f9151f7',1,'cv::stereo::StereoBinarySGBM::MODE_SGBM'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ada549f34c6f030a64d3a1d2f364b547ba21fac9fae6db6a60a940fd24cc61f081',1,'cv::StereoSGBM::MODE_SGBM']]], - ['mode_5fsgbm_5f3way_877',['MODE_SGBM_3WAY',['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ada549f34c6f030a64d3a1d2f364b547baa3ffd07d169f0d913c2402bf20595a9f',1,'cv::StereoSGBM']]], - ['mode_5ftrack_5fneg_878',['MODE_TRACK_NEG',['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#a2834448d2e780fea900ec7fefae1a138a80763dad360e213fdfa9352f663a0fa3',1,'cv::TrackerSamplerCSC']]], - ['mode_5ftrack_5fpos_879',['MODE_TRACK_POS',['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#a2834448d2e780fea900ec7fefae1a138a72fb1cdd9db81a1ba427357e0c3f4b2a',1,'cv::TrackerSamplerCSC']]], - ['model_880',['Fisheye camera model',['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html',1,'']]], - ['model_881',['Model',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html',1,'cv::dnn::Model'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html',1,'cv::face::FacemarkAAM::Model'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a5ccfd862a641a6b48472a88d821f33bf',1,'cv::dnn::Model::Model()'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a7ad13e315a170b9c5e3ca212a1a0a909',1,'cv::dnn::Model::Model(const String &model, const String &config="")'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#aeda26984960f2985f0071e33a51b34d3',1,'cv::dnn::Model::Model(const Net &network)']]], - ['model_882',['model',['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a267ed2dd0c97c9801fcddafa031600a5',1,'cv::Tracker::model'],['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a39135d03f0aca8fb099d0960a277e7b6',1,'cv::tracking::UnscentedKalmanFilterParams::model']]], - ['model_20analysis_883',['Training Model Analysis',['https://docs.opencv.org/4.2.0/d8/d09/tutorial_model_analysis.html',1,'']]], - ['model_5fanalysis_2emarkdown_884',['model_analysis.markdown',['https://docs.opencv.org/4.2.0/d7/d68/model__analysis_8markdown.html',1,'']]], - ['model_5ffilename_885',['model_filename',['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#ac9ddca5f45143782579a703e7e6e2b1e',1,'cv::face::FacemarkAAM::Params::model_filename'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a67fd2298bb7efdd49831707e24108491',1,'cv::face::FacemarkLBF::Params::model_filename']]], - ['model_5fpath_886',['model_path',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#ac819ca1d4c72c0ff505565b7c12b137f',1,'cv::gapi::ie::detail::ParamDesc']]], - ['model_5fscale_5fidx_887',['model_scale_idx',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html#aada12fc918928a31d73519ad8b3d0976',1,'cv::face::FacemarkAAM::Config']]], - ['modelestimation_888',['modelEstimation',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a84d712f280d1c4d0a8311f8f53089a2e',1,'cv::TrackerModel']]], - ['modelestimationimpl_889',['modelEstimationImpl',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#ad528142f5c5a1d2a7e122f54384a63ae',1,'cv::TrackerModel']]], - ['modelindex_890',['modelIndex',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a095abb29ff9c0a535f310468a541ada9',1,'cv::ppf_match_3d::Pose3D']]], - ['models_891',['Deformable Part-based Models',['https://docs.opencv.org/4.2.0/d9/d12/group__dpm.html',1,'']]], - ['models_892',['Load Caffe framework models',['https://docs.opencv.org/4.2.0/d5/de7/tutorial_dnn_googlenet.html',1,'']]], - ['models_20and_20derivated_20tools_893',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], - ['modelupdate_894',['modelUpdate',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a5049f30348c44b6aebb3651f3767dab0',1,'cv::TrackerModel']]], - ['modelupdateimpl_895',['modelUpdateImpl',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a6e17cc80adc68abf0c172be19b4bdc8a',1,'cv::TrackerModel']]], - ['modifiedcensustransform_896',['modifiedCensusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a27aeb319591612c6833327da2708277c',1,'cv::stereo::modifiedCensusTransform(const cv::Mat &img1, const cv::Mat &img2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2, const int type, int t=0, const cv::Mat &IntegralImage1=cv::Mat::zeros(100, 100, CV_8UC1), const cv::Mat &IntegralImage2=cv::Mat::zeros(100, 100, CV_8UC1))'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#af330a2a2f52998367d0c845f62d022a6',1,'cv::stereo::modifiedCensusTransform(const cv::Mat &img1, int kernelSize, cv::Mat &dist, const int type, int t=0, const cv::Mat &IntegralImage=cv::Mat::zeros(100, 100, CV_8UC1))']]], - ['modifiedcscensus_897',['ModifiedCsCensus',['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html',1,'cv::stereo::ModifiedCsCensus< num_images >'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#a2d69cd7875e886e398ebabe4dab2b7e3',1,'cv::stereo::ModifiedCsCensus::ModifiedCsCensus()'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#aedb39a47b4821dd3deb2cc334daeabcd',1,'cv::stereo::ModifiedCsCensus::ModifiedCsCensus(uint8_t **images, int ker)']]], - ['modifiers_898',['modifiers',['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#a81e30567f8f4099804cb2980ed4026df',1,'cv::viz::KeyboardEvent::modifiers'],['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a0a3d0f441e1efe3f3f8b201174dd434f',1,'cv::viz::MouseEvent::modifiers']]], - ['modify_20and_20save_20an_20image_899',['Load, Modify, and Save an Image',['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'']]], - ['modify_5fa_900',['MODIFY_A',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a4700f5207e66cdd9924bf64e34911832afb6aab7965c8f601696b10fa109e2789',1,'cv::SVD']]], - ['module_901',['module',['https://docs.opencv.org/4.2.0/d9/d97/tutorial_table_of_content_features2d.html',1,'2D Features framework (feature2d module)'],['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'ArUco marker detection (aruco module)'],['https://docs.opencv.org/4.2.0/d6/d55/tutorial_table_of_content_calib3d.html',1,'Camera calibration and 3D reconstruction (calib3d module)'],['https://eigen.tuxfamily.org/dox/group__Cholesky__Module.html',1,'Cholesky module'],['https://eigen.tuxfamily.org/dox/group__CholmodSupport__Module.html',1,'CholmodSupport module'],['https://docs.opencv.org/4.2.0/da/de7/tutorial_table_of_content_photo.html',1,'Computational photography (photo module)'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html',1,'Core module'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html',1,'Deep Neural Network module'],['https://docs.opencv.org/4.2.0/d2/d58/tutorial_table_of_content_dnn.html',1,'Deep Neural Networks (dnn module)'],['https://eigen.tuxfamily.org/dox/group__Eigenvalues__Module.html',1,'Eigenvalues module'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html',1,'Geometry module'],['https://docs.opencv.org/4.2.0/da/d2c/tutorial_table_of_content_gpu.html',1,'GPU-Accelerated Computer Vision (cuda module)'],['https://docs.opencv.org/4.2.0/df/d7e/tutorial_table_of_content_gapi.html',1,'Graph API (gapi module)'],['https://docs.opencv.org/4.2.0/d0/de2/tutorial_table_of_content_highgui.html',1,'High Level GUI and Media (highgui module)'],['https://eigen.tuxfamily.org/dox/group__Householder__Module.html',1,'Householder module'],['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'Image Input and Output (imgcodecs module)'],['https://docs.opencv.org/4.2.0/d7/da8/tutorial_table_of_content_imgproc.html',1,'Image Processing (imgproc module)'],['https://docs.opencv.org/4.2.0/d0/d33/tutorial_table_of_content_stitching.html',1,'Images stitching (stitching module)'],['https://eigen.tuxfamily.org/dox/group__IterativeLinearSolvers__Module.html',1,'IterativeLinearSolvers module'],['https://eigen.tuxfamily.org/dox/group__Jacobi__Module.html',1,'Jacobi module'],['https://eigen.tuxfamily.org/dox/group__KLUSupport__Module.html',1,'KLUSupport module'],['https://eigen.tuxfamily.org/dox/group__LU__Module.html',1,'LU module'],['https://docs.opencv.org/4.2.0/d1/d69/tutorial_table_of_content_ml.html',1,'Machine Learning (ml module)'],['https://eigen.tuxfamily.org/dox/group__MetisSupport__Module.html',1,'MetisSupport module'],['https://docs.opencv.org/4.2.0/d2/d64/tutorial_table_of_content_objdetect.html',1,'Object Detection (objdetect module)'],['https://eigen.tuxfamily.org/dox/group__OrderingMethods__Module.html',1,'OrderingMethods module'],['https://eigen.tuxfamily.org/dox/group__PardisoSupport__Module.html',1,'PardisoSupport module'],['https://eigen.tuxfamily.org/dox/group__PaStiXSupport__Module.html',1,'PaStiXSupport module'],['https://eigen.tuxfamily.org/dox/group__QR__Module.html',1,'QR module'],['https://docs.opencv.org/4.2.0/d9/d58/tutorial_table_of_content_quasi_dense_stereo.html',1,'Quasi Dense Stereo (stereo module)'],['https://eigen.tuxfamily.org/dox/group__Sparse__Module.html',1,'Sparse meta-module'],['https://eigen.tuxfamily.org/dox/group__SparseCholesky__Module.html',1,'SparseCholesky module'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html',1,'SparseCore module'],['https://eigen.tuxfamily.org/dox/group__SparseLU__Module.html',1,'SparseLU module'],['https://eigen.tuxfamily.org/dox/group__SparseQR__Module.html',1,'SparseQR module'],['https://eigen.tuxfamily.org/dox/group__SPQRSupport__Module.html',1,'SuiteSparseQR module'],['https://eigen.tuxfamily.org/dox/group__SuperLUSupport__Module.html',1,'SuperLUSupport module'],['https://eigen.tuxfamily.org/dox/group__SVD__Module.html',1,'SVD module'],['https://docs.opencv.org/4.2.0/d0/dda/tutorial_table_of_content_text.html',1,'Text module'],['https://docs.opencv.org/4.2.0/de/d7a/tutorial_table_of_content_core.html',1,'The Core Functionality (core module)'],['https://docs.opencv.org/4.2.0/d3/d89/tutorial_table_of_content_bgsegm.html',1,'Tutorials for bgsegm module'],['https://docs.opencv.org/4.2.0/de/d27/tutorial_table_of_content_face.html',1,'Tutorials for face module'],['https://eigen.tuxfamily.org/dox/group__UmfPackSupport__Module.html',1,'UmfPackSupport module'],['https://docs.opencv.org/4.2.0/da/dd0/tutorial_table_of_content_video.html',1,'Video analysis (video module)'],['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'Video Input and Output (videoio module)']]], - ['module_20brings_20implementations_20of_20different_20image_20hashing_20algorithms_902',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], - ['module_20changelog_903',['Face module changelog',['https://docs.opencv.org/4.2.0/d9/d47/face_changelog.html',1,'']]], - ['module_20faq_904',['Aruco module FAQ',['https://docs.opencv.org/4.2.0/d1/dcb/tutorial_aruco_faq.html',1,'']]], - ['module_20installation_905',['SFM module installation',['https://docs.opencv.org/4.2.0/db/db8/tutorial_sfm_installation.html',1,'']]], - ['module_20introduction_906',['CUDA Module Introduction',['https://docs.opencv.org/4.2.0/d2/dbc/cuda_intro.html',1,'']]], - ['module_20retina_20introduction_907',['Bioinspired Module Retina Introduction',['https://docs.opencv.org/4.2.0/d2/d94/bioinspired_retina.html',1,'']]], - ['modules_908',['modules',['https://eigen.tuxfamily.org/dox/group__Support__modules.html',1,'Support modules'],['https://docs.opencv.org/4.2.0/d3/d81/tutorial_contrib_root.html',1,'Tutorials for contrib modules']]], - ['modulus_909',['modulus',['https://docs.opencv.org/4.2.0/d7/d7f/structcv_1_1cudev_1_1modulus.html',1,'cv::cudev::modulus< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07371.html',1,'std::modulus< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a9c73f24c92d06c4aa7c5b2c37d8c6dcb',1,'std::linear_congruential_engine::modulus']]], - ['modulus_3c_20void_20_3e_910',['modulus< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07395.html',1,'std']]], - ['moments_911',['Moments',['https://docs.opencv.org/4.2.0/d0/d49/tutorial_moments.html',1,'Image Moments'],['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html',1,'cv::Moments'],['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a0382b98fdb23acdcb05c91a2a44e5a1f',1,'cv::Moments::Moments()'],['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ab8972f76cccd51af351cbda199fb4a0d',1,'cv::Moments::Moments(double m00, double m10, double m01, double m20, double m11, double m02, double m30, double m21, double m12, double m03)']]], - ['moments_912',['moments',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga556a180f43cab22649c23ada36a8a139',1,'cv::moments()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga556a180f43cab22649c23ada36a8a139',1,'moments(InputArray array, bool binaryImage=false)(Global Namespace)']]], - ['moments_2emarkdown_913',['moments.markdown',['https://docs.opencv.org/4.2.0/d9/d20/moments_8markdown.html',1,'']]], - ['monetary_914',['monetary',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a344e6500c766e554a71933878f1fc654',1,'std::locale']]], - ['money_5fbase_915',['money_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06003.html',1,'std']]], - ['money_5fget_916',['money_get',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html',1,'std::money_get< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a56b27ade4915b3ac1ae0e358f5f6266e',1,'std::money_get::money_get()']]], - ['money_5fput_917',['money_put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html',1,'std::money_put< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a69471496da9b95b41529a08b14c063f5',1,'std::money_put::money_put()']]], - ['moneypunct_918',['moneypunct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html',1,'std::moneypunct< _CharT, _Intl >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a82d4bbb3eaae4c5cf74e3652be13e67e',1,'std::moneypunct::moneypunct(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#aaabd1d7f1c7014add2c854305c76e73a',1,'std::moneypunct::moneypunct(__cache_type *__cache, size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a26aa970ef261e45586f3b161d2ec28e7',1,'std::moneypunct::moneypunct(__c_locale __cloc, const char *__s, size_t __refs=0)']]], - ['moneypunct_5fbyname_919',['moneypunct_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06019.html',1,'std']]], - ['monochrome_920',['Monochrome',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga1887af7daca9ccca0f51f90bc8777280a854c4e9c8ccb88e9bad306cdc21d38ee',1,'cv::cudacodec::Monochrome'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga1887af7daca9ccca0f51f90bc8777280a854c4e9c8ccb88e9bad306cdc21d38ee',1,'Monochrome(Global Namespace)']]], - ['monochrome_5ftransfer_921',['MONOCHROME_TRANSFER',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca8a64bb74d3ef61a73cf755f3a881fe70',1,'cv::MONOCHROME_TRANSFER'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca8a64bb74d3ef61a73cf755f3a881fe70',1,'MONOCHROME_TRANSFER(Global Namespace)']]], - ['monostate_922',['monostate',['https://docs.opencv.org/4.2.0/d5/da7/structcv_1_1util_1_1monostate.html',1,'cv::util']]], - ['more_20functions_923',['More Functions',['https://docs.opencv.org/4.2.0/d5/d45/tutorial_py_contours_more_functions.html',1,'Contours : More Functions'],['https://docs.opencv.org/4.2.0/d8/d1c/tutorial_js_contours_more_functions.html',1,'Contours : More Functions']]], - ['more_20morphology_20transformations_924',['More Morphology Transformations',['https://docs.opencv.org/4.2.0/d3/dbe/tutorial_opening_closing_hats.html',1,'']]], - ['moreaccuratemotionwobblesuppressor_925',['MoreAccurateMotionWobbleSuppressor',['https://docs.opencv.org/4.2.0/d8/da1/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressor.html',1,'cv::videostab']]], - ['moreaccuratemotionwobblesuppressorbase_926',['MoreAccurateMotionWobbleSuppressorBase',['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html',1,'cv::videostab::MoreAccurateMotionWobbleSuppressorBase'],['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html#a5c92896a72d9f706bca04fae077f614f',1,'cv::videostab::MoreAccurateMotionWobbleSuppressorBase::MoreAccurateMotionWobbleSuppressorBase()']]], - ['morph_927',['morph',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga24d63a25f503c51da1d80c5d86cc27bd',1,'cv::hal::morph()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga24d63a25f503c51da1d80c5d86cc27bd',1,'morph()(Global Namespace)']]], - ['morph_5fblackhat_928',['MORPH_BLACKHAT',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a24d27f56df6b98b1cb92ae8108d4638f',1,'cv::MORPH_BLACKHAT'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a24d27f56df6b98b1cb92ae8108d4638f',1,'MORPH_BLACKHAT(Global Namespace)']]], - ['morph_5fclose_929',['MORPH_CLOSE',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a68c4b9c6144a30bcd52d1cdf39bb30e1',1,'cv::MORPH_CLOSE'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a68c4b9c6144a30bcd52d1cdf39bb30e1',1,'MORPH_CLOSE(Global Namespace)']]], - ['morph_5fcross_930',['MORPH_CROSS',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggac2db39b56866583a95a5680313c314ada318435753d0b9f7faa241a658ec2e191',1,'cv::MORPH_CROSS'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggac2db39b56866583a95a5680313c314ada318435753d0b9f7faa241a658ec2e191',1,'MORPH_CROSS(Global Namespace)']]], - ['morph_5fdilate_931',['MORPH_DILATE',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a2b9f6b6fb168b4d1d5277caebfe7b73d',1,'cv::MORPH_DILATE'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a2b9f6b6fb168b4d1d5277caebfe7b73d',1,'MORPH_DILATE(Global Namespace)']]], - ['morph_5fellipse_932',['MORPH_ELLIPSE',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggac2db39b56866583a95a5680313c314ada33a3c67a61f349d21c507d05c53a755f',1,'cv::MORPH_ELLIPSE'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggac2db39b56866583a95a5680313c314ada33a3c67a61f349d21c507d05c53a755f',1,'MORPH_ELLIPSE(Global Namespace)']]], - ['morph_5ferode_933',['MORPH_ERODE',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32aa3783a21b429f4c31c178264a0403fcd',1,'cv::MORPH_ERODE'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32aa3783a21b429f4c31c178264a0403fcd',1,'MORPH_ERODE(Global Namespace)']]], - ['morph_5fgradient_934',['MORPH_GRADIENT',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a887efd64e82cee95a62f851c7f3b617b',1,'cv::MORPH_GRADIENT'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a887efd64e82cee95a62f851c7f3b617b',1,'MORPH_GRADIENT(Global Namespace)']]], - ['morph_5fhitmiss_935',['MORPH_HITMISS',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32acf55ff766595ec0174ba42852f0ac264',1,'cv::MORPH_HITMISS'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32acf55ff766595ec0174ba42852f0ac264',1,'MORPH_HITMISS(Global Namespace)']]], - ['morph_5flines_5fdetection_2emd_936',['morph_lines_detection.md',['https://docs.opencv.org/4.2.0/db/d18/morph__lines__detection_8md.html',1,'']]], - ['morph_5fopen_937',['MORPH_OPEN',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a08d3cc3a2ace00cec488966d31fa29ea',1,'cv::MORPH_OPEN'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a08d3cc3a2ace00cec488966d31fa29ea',1,'MORPH_OPEN(Global Namespace)']]], - ['morph_5frect_938',['MORPH_RECT',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggac2db39b56866583a95a5680313c314ada260c4cbde19a749726763c01a074c60f',1,'cv::MORPH_RECT'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggac2db39b56866583a95a5680313c314ada260c4cbde19a749726763c01a074c60f',1,'MORPH_RECT(Global Namespace)']]], - ['morph_5ftophat_939',['MORPH_TOPHAT',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32ada67be24f4dce6d7e6c57527f8724f3b',1,'cv::MORPH_TOPHAT'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32ada67be24f4dce6d7e6c57527f8724f3b',1,'MORPH_TOPHAT(Global Namespace)']]], - ['morphological_20operations_940',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], - ['morphological_20transformations_941',['Morphological Transformations',['https://docs.opencv.org/4.2.0/d9/d61/tutorial_py_morphological_ops.html',1,'Morphological Transformations'],['https://docs.opencv.org/4.2.0/d4/d76/tutorial_js_morphological_ops.html',1,'Morphological Transformations']]], - ['morphology_20on_20run_20length_20encoded_20image_942',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], - ['morphology_20transformations_943',['More Morphology Transformations',['https://docs.opencv.org/4.2.0/d3/dbe/tutorial_opening_closing_hats.html',1,'']]], - ['morphologydefaultbordervalue_944',['morphologyDefaultBorderValue',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga94756fad83d9d24d29c9bf478558c40a',1,'cv::morphologyDefaultBorderValue()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga94756fad83d9d24d29c9bf478558c40a',1,'morphologyDefaultBorderValue()(Global Namespace)']]], - ['morphologyex_945',['morphologyEx',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga67493776e3ad1a3df63883829375201f',1,'cv::morphologyEx()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga939a4d8afa86b012f6e3d006e6a32180',1,'cv::ximgproc::rl::morphologyEx()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga67493776e3ad1a3df63883829375201f',1,'morphologyEx(InputArray src, OutputArray dst, int op, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga939a4d8afa86b012f6e3d006e6a32180',1,'morphologyEx(InputArray rlSrc, OutputArray rlDest, int op, InputArray rlKernel, bool bBoundaryOnForErosion=true, Point anchor=Point(0, 0))(Global Namespace)']]], - ['morphshapes_946',['MorphShapes',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gac2db39b56866583a95a5680313c314ad',1,'cv::MorphShapes'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gac2db39b56866583a95a5680313c314ad',1,'MorphShapes(Global Namespace)']]], - ['morphtypes_947',['MorphTypes',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga7be549266bad7b2e6a04db49827f9f32',1,'cv::MorphTypes'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga7be549266bad7b2e6a04db49827f9f32',1,'MorphTypes(Global Namespace)']]], - ['mos_948',['mos',['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html#a4cf5763d3653ab631cbf6afa32dbf9f3',1,'cv::gapi::wip::draw::Mosaic']]], - ['mosaic_949',['Mosaic',['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html',1,'cv::gapi::wip::draw::Mosaic'],['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html#ad655ea1c3d0eff93300e5cbcbbe434b6',1,'cv::gapi::wip::draw::Mosaic::Mosaic()']]], - ['motempl_2ehpp_950',['motempl.hpp',['https://docs.opencv.org/4.2.0/da/d48/motempl_8hpp.html',1,'']]], - ['motion_951',['Motion',['https://docs.opencv.org/4.2.0/d8/d8c/group__sfm.html',1,'Structure From Motion'],['https://docs.opencv.org/4.2.0/de/d7c/tutorial_table_of_content_sfm.html',1,'Structure From Motion']]], - ['motion_20analysis_952',['Motion Analysis',['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html',1,'']]], - ['motion_20analysis_20and_20object_20tracking_953',['Motion Analysis and Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'']]], - ['motion_20deblur_20filter_954',['Motion Deblur Filter',['https://docs.opencv.org/4.2.0/d1/dfd/tutorial_motion_deblur_filter.html',1,'']]], - ['motion_20estimation_955',['Motion Estimation',['https://docs.opencv.org/4.2.0/d5/dab/tutorial_sfm_trajectory_estimation.html',1,'Camera Motion Estimation'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html',1,'Global Motion Estimation']]], - ['motion_5faffine_956',['MOTION_AFFINE',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809faa22eb135b6afe090a8a0d228fd62634a',1,'cv::MOTION_AFFINE'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809faa22eb135b6afe090a8a0d228fd62634a',1,'MOTION_AFFINE(Global Namespace)']]], - ['motion_5faffinity_5fw_957',['motion_affinity_w',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a487649d2cd4c0e9a94c0f7a9e0fa3ba2',1,'cv::tbm::TrackerParams']]], - ['motion_5fcore_2ehpp_958',['motion_core.hpp',['https://docs.opencv.org/4.2.0/de/d4e/motion__core_8hpp.html',1,'']]], - ['motion_5fdeblur_5ffilter_2emarkdown_959',['motion_deblur_filter.markdown',['https://docs.opencv.org/4.2.0/d9/d0d/motion__deblur__filter_8markdown.html',1,'']]], - ['motion_5festimators_2ehpp_960',['motion_estimators.hpp',['https://docs.opencv.org/4.2.0/d3/d73/motion__estimators_8hpp.html',1,'']]], - ['motion_5feuclidean_961',['MOTION_EUCLIDEAN',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809fa075fb2a93001cb4cc1ba1b22af1e8848',1,'cv::MOTION_EUCLIDEAN'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809fa075fb2a93001cb4cc1ba1b22af1e8848',1,'MOTION_EUCLIDEAN(Global Namespace)']]], - ['motion_5fhomography_962',['MOTION_HOMOGRAPHY',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809fa81a5e999a7fde5656ce1ca0458741b27',1,'cv::MOTION_HOMOGRAPHY'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809fa81a5e999a7fde5656ce1ca0458741b27',1,'MOTION_HOMOGRAPHY(Global Namespace)']]], - ['motion_5fstabilizing_2ehpp_963',['motion_stabilizing.hpp',['https://docs.opencv.org/4.2.0/da/d38/motion__stabilizing_8hpp.html',1,'']]], - ['motion_5ftranslation_964',['MOTION_TRANSLATION',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809fa01106d6d20122b782ff25eaeffe9a5be',1,'cv::MOTION_TRANSLATION'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809fa01106d6d20122b782ff25eaeffe9a5be',1,'MOTION_TRANSLATION(Global Namespace)']]], - ['motionestimator_965',['motionEstimator',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a8ab5adc5cefe91ef4397bd2d01111b26',1,'cv::videostab::StabilizerBase::motionEstimator()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#ab4290a6b6ae538ca60c644cb7cf34038',1,'cv::videostab::WobbleSuppressorBase::motionEstimator()']]], - ['motionestimator_5f_966',['motionEstimator_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ad668ce4753c5633eab4704eda99c2936',1,'cv::videostab::StabilizerBase::motionEstimator_'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#aef9a4674e65b999cd96a1c4ef756c3a1',1,'cv::videostab::WobbleSuppressorBase::motionEstimator_']]], - ['motionestimatorbase_967',['MotionEstimatorBase',['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html',1,'cv::videostab::MotionEstimatorBase'],['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html#ab1bc0253fe2d279148445e0e2f42c508',1,'cv::videostab::MotionEstimatorBase::MotionEstimatorBase()']]], - ['motionestimatorl1_968',['MotionEstimatorL1',['https://docs.opencv.org/4.2.0/d7/d29/classcv_1_1videostab_1_1MotionEstimatorL1.html',1,'cv::videostab::MotionEstimatorL1'],['https://docs.opencv.org/4.2.0/d7/d29/classcv_1_1videostab_1_1MotionEstimatorL1.html#adc5c868f661775fb37a31a51ab1ea0d7',1,'cv::videostab::MotionEstimatorL1::MotionEstimatorL1()']]], - ['motionestimatorransacl2_969',['MotionEstimatorRansacL2',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html',1,'cv::videostab::MotionEstimatorRansacL2'],['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#ae7d9545b45bc537042cdc4251a8237ca',1,'cv::videostab::MotionEstimatorRansacL2::MotionEstimatorRansacL2()']]], - ['motionfilter_970',['motionFilter',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#a3b34bc7dc9c291f603aacb971fe41ee5',1,'cv::videostab::OnePassStabilizer']]], - ['motionfilter_5f_971',['motionFilter_',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#a6d98abb6281250f3c56b249e4af0ae19',1,'cv::videostab::OnePassStabilizer']]], - ['motionfilterbase_972',['MotionFilterBase',['https://docs.opencv.org/4.2.0/dd/df4/classcv_1_1videostab_1_1MotionFilterBase.html',1,'cv::videostab']]], - ['motionfromessential_973',['motionFromEssential',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaee634880c5f298096ab2fc514de87cbd',1,'cv::sfm::motionFromEssential()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaee634880c5f298096ab2fc514de87cbd',1,'motionFromEssential()(Global Namespace)']]], - ['motionfromessentialchoosesolution_974',['motionFromEssentialChooseSolution',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga6bd98cb968781abf62659eedc0d0481e',1,'cv::sfm::motionFromEssentialChooseSolution()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga6bd98cb968781abf62659eedc0d0481e',1,'motionFromEssentialChooseSolution()(Global Namespace)']]], - ['motioninpainter_975',['MotionInpainter',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html',1,'cv::videostab::MotionInpainter'],['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#aebf592dca89ac5e3f3cf94180b1fcad4',1,'cv::videostab::MotionInpainter::MotionInpainter()']]], - ['motionmodel_976',['motionModel',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html#a841d954ea87bc9453590180096b36646',1,'cv::videostab::ImageMotionEstimatorBase::motionModel()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a0ad21d4676d5e0d07766f124f90b1a7e',1,'cv::videostab::InpainterBase::motionModel()'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#aef396847ece742047bcf40a415ffa898',1,'cv::videostab::KeypointBasedMotionEstimator::motionModel()'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a29e99ca5a23db566de09744a291363c5',1,'cv::videostab::LpMotionStabilizer::motionModel()'],['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html#a7a848cee402585520565e8346221af68',1,'cv::videostab::MotionEstimatorBase::motionModel()'],['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html#ac7c4c2596a7b18602ec444f4c3642409',1,'cv::videostab::ToFileMotionWriter::motionModel()']]], - ['motionmodel_977',['MotionModel',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#gac61e59db30b7d13983885d3ad3116ce1',1,'cv::videostab::MotionModel'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#gac61e59db30b7d13983885d3ad3116ce1',1,'MotionModel(Global Namespace)']]], - ['motionmodel_5f_978',['motionModel_',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a9aaefb1f57fb4ca73438b391473206c7',1,'cv::videostab::InpainterBase']]], - ['motions_979',['motions',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a03c5fbf6b554fa16313e5966d4f650a9',1,'cv::videostab::DeblurerBase::motions()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#acd8158287f603009374c282ce20ccc95',1,'cv::videostab::InpainterBase::motions()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a4f646cec10ba28feddd082134edf2a60',1,'cv::videostab::WobbleSuppressorBase::motions() const']]], - ['motions2_980',['motions2',['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#ad60cdff01ba2c03f41000bcfa422b97b',1,'cv::videostab::WobbleSuppressorBase']]], - ['motions2_5f_981',['motions2_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#aba137eabaa62e57971247c939d447e08',1,'cv::videostab::TwoPassStabilizer::motions2_'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a5de5527f05d3a691f0d8bdd1111d857d',1,'cv::videostab::WobbleSuppressorBase::motions2_']]], - ['motions_5f_982',['motions_',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a076bf2cf50f92bc5e0684810179ed71c',1,'cv::videostab::DeblurerBase::motions_'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a464def3695a8ef1ff91666e896ee1005',1,'cv::videostab::InpainterBase::motions_'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a0f134ba4672305e6949a62cdfd8b8d36',1,'cv::videostab::StabilizerBase::motions_'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#aeab365b7e78c874fce96294716638687',1,'cv::videostab::WobbleSuppressorBase::motions_']]], - ['motionsaliency_983',['MotionSaliency',['https://docs.opencv.org/4.2.0/d2/df7/classcv_1_1saliency_1_1MotionSaliency.html',1,'cv::saliency']]], - ['motionsaliencybinwangapr2014_984',['MotionSaliencyBinWangApr2014',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html',1,'cv::saliency::MotionSaliencyBinWangApr2014'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a48791bfcad75fa0572683f23a2fbb3c8',1,'cv::saliency::MotionSaliencyBinWangApr2014::MotionSaliencyBinWangApr2014()']]], - ['motionstabilizationpipeline_985',['MotionStabilizationPipeline',['https://docs.opencv.org/4.2.0/d9/d76/classcv_1_1videostab_1_1MotionStabilizationPipeline.html',1,'cv::videostab']]], - ['motionstabilizer_986',['motionStabilizer',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a7d5d9714f66ed34381f21f9e416a3c75',1,'cv::videostab::TwoPassStabilizer']]], - ['motionstabilizer_5f_987',['motionStabilizer_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#ab46fac67a00e7184077111bc8e6a560d',1,'cv::videostab::TwoPassStabilizer']]], - ['motorid_5ft_988',['motorid_t',['../namespacerobot_1_1types.html#a7278b81a300fa12b4b6525bff976f190',1,'robot::types']]], - ['motormode_5ft_989',['motormode_t',['../namespacecan_1_1motor.html#a74e4e1121ce20fb929e82f4d5caed88b',1,'can::motor']]], - ['motorpidmap_990',['motorPIDMap',['../namespacerobot.html#ac1eaa5d6745c8aad93d6304c0f8b1821',1,'robot']]], - ['motorserialidmap_991',['motorSerialIDMap',['../namespacerobot.html#aa66a3a3666eb218c89671933350db78f',1,'robot']]], - ['mountedperipheral_5ft_992',['mountedperipheral_t',['../namespacerobot_1_1types.html#aa93c10246999d2fdb71ba7bdb792c235',1,'robot::types']]], - ['mouse_20as_20a_20paint_20brush_993',['Mouse as a Paint-Brush',['https://docs.opencv.org/4.2.0/db/d5b/tutorial_py_mouse_handling.html',1,'']]], - ['mousebutton_994',['MouseButton',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#ada240f2528500ad1615e76fb2fd9e2ba',1,'cv::viz::MouseEvent']]], - ['mousebuttonpress_995',['MouseButtonPress',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39ac8445731d7e6930f745a303acea1d1e5',1,'cv::viz::MouseEvent']]], - ['mousebuttonrelease_996',['MouseButtonRelease',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39afa027c59ebbc0dd8f412d55e39556ceb',1,'cv::viz::MouseEvent']]], - ['mousecallback_997',['MouseCallback',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a11e6194c24c4816e963fc704f3d0c36a',1,'cv::viz::Viz3d::MouseCallback'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gab7aed186e151d5222ef97192912127a4',1,'cv::MouseCallback'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gab7aed186e151d5222ef97192912127a4',1,'MouseCallback(Global Namespace)']]], - ['mousedblclick_998',['MouseDblClick',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39a819bad74662968724aa3909679ee69b9',1,'cv::viz::MouseEvent']]], - ['mouseevent_999',['MouseEvent',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html',1,'cv::viz::MouseEvent'],['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a2566c9701613232f23ba6d9bae559853',1,'cv::viz::MouseEvent::MouseEvent()']]], - ['mouseeventflags_1000',['MouseEventFlags',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gaab4dc057947f70058c80626c9f1c25ce',1,'cv::MouseEventFlags'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gaab4dc057947f70058c80626c9f1c25ce',1,'MouseEventFlags(Global Namespace)']]], - ['mouseeventtypes_1001',['MouseEventTypes',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga927593befdddc7e7013602bca9b079b0',1,'cv::MouseEventTypes'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga927593befdddc7e7013602bca9b079b0',1,'MouseEventTypes(Global Namespace)']]], - ['mousemove_1002',['MouseMove',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39a2099ae3377b1e50e784da3910e0508dd',1,'cv::viz::MouseEvent']]], - ['mousescrolldown_1003',['MouseScrollDown',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39a37899e1ded68a942b8b91fc85a95b488',1,'cv::viz::MouseEvent']]], - ['mousescrollup_1004',['MouseScrollUp',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39a0b60ae14d045a90a6680e6ad33fd45d7',1,'cv::viz::MouseEvent']]], - ['mov_1005',['mov',['https://docs.opencv.org/4.2.0/df/d63/classcv_1_1detail_1_1BasicVectorRef.html#aa176aefc4d3a43adba8fda62632e1f1c',1,'cv::detail::BasicVectorRef::mov()'],['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html#a51c97bca58c3b1894fa588e45dcdf370',1,'cv::detail::VectorRef::mov()'],['https://docs.opencv.org/4.2.0/d2/dab/classcv_1_1detail_1_1VectorRefT.html#a91343bb7c3b8bd2960721ef84d778dcc',1,'cv::detail::VectorRefT::mov()']]], - ['move_1006',['move',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ab6a8109eb6c9bb2e04fe32247d32eb59',1,'cv::_OutputArray::move(UMat &u) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ab185427c5ad1b0a5c75a0eae05171663',1,'cv::_OutputArray::move(Mat &m) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9f81219bfbfaac50d44f79095a639620',1,'std::move(_Tp &&__t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaedffc88b77674cbf9966e30a9c275bb6',1,'std::move(_II __first, _II __last, _OI __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaedffc88b77674cbf9966e30a9c275bb6',1,'move(_II __first, _II __last, _OI __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9f81219bfbfaac50d44f79095a639620',1,'move(_Tp &&__t) noexcept(Global Namespace)']]], - ['move_2eh_1007',['move.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00425.html',1,'']]], - ['move_5fbackward_1008',['move_backward',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga1743475fe627f5302b98ae41f8bf0ad5',1,'std::move_backward()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga1743475fe627f5302b98ae41f8bf0ad5',1,'move_backward()(Global Namespace)']]], - ['move_5fif_5fnoexcept_1009',['move_if_noexcept',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gad065507b1d170a56e1ee2c77251554a3',1,'std::move_if_noexcept()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gad065507b1d170a56e1ee2c77251554a3',1,'move_if_noexcept()(Global Namespace)']]], - ['move_5fiterator_1010',['move_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07675.html',1,'std']]], - ['movewindow_1011',['moveWindow',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8d86b207f7211250dbe6e28f76307ffb',1,'cv::moveWindow()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8d86b207f7211250dbe6e28f76307ffb',1,'moveWindow()(Global Namespace)']]], - ['mp_1012',['MP',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a658b2984b9a64a01deabd9420eb70d7d',1,'cv::tracking::UnscentedKalmanFilterParams']]], - ['mpeg1_1013',['MPEG1',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a76b84b89602cb58f49870dcc45a8b8cc',1,'cv::cudacodec::MPEG1'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a76b84b89602cb58f49870dcc45a8b8cc',1,'MPEG1(Global Namespace)']]], - ['mpeg2_1014',['MPEG2',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146ab8ff0b5ad78506988d6138ea88e96b5a',1,'cv::cudacodec::MPEG2'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146ab8ff0b5ad78506988d6138ea88e96b5a',1,'MPEG2(Global Namespace)']]], - ['mpeg4_1015',['MPEG4',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a9948c662291bfed72125faca82012e3f',1,'cv::cudacodec::MPEG4'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a9948c662291bfed72125faca82012e3f',1,'MPEG4(Global Namespace)']]], - ['msa_5fmacros_2eh_1016',['msa_macros.h',['https://docs.opencv.org/4.2.0/d3/d86/msa__macros_8h.html',1,'']]], - ['msddetector_1017',['MSDDetector',['https://docs.opencv.org/4.2.0/d0/dcf/classcv_1_1xfeatures2d_1_1MSDDetector.html',1,'cv::xfeatures2d']]], - ['mser_1018',['MSER',['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html',1,'cv']]], - ['mserstoerstats_1019',['MSERsToERStats',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gaa40b490a66fa21eb1d89163202f69c86',1,'cv::text::MSERsToERStats()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gaa40b490a66fa21eb1d89163202f69c86',1,'MSERsToERStats()(Global Namespace)']]], - ['msg_1020',['msg',['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a7ead458b4fc88ebca20b231383c49845',1,'cv::Exception']]], - ['mslic_1021',['MSLIC',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gga6c6f7deab0bd328066f0ada72c2ce57ba7f820d4b97c57b9d42dfa862a8ab347a',1,'cv::ximgproc::MSLIC'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gga6c6f7deab0bd328066f0ada72c2ce57ba7f820d4b97c57b9d42dfa862a8ab347a',1,'MSLIC(Global Namespace)']]], - ['msm_5fepfl_1022',['MSM_epfl',['https://docs.opencv.org/4.2.0/dc/de4/classcv_1_1datasets_1_1MSM__epfl.html',1,'cv::datasets']]], - ['msm_5fepfl_2ehpp_1023',['msm_epfl.hpp',['https://docs.opencv.org/4.2.0/d6/d8b/msm__epfl_8hpp.html',1,'']]], - ['msm_5fepflobj_1024',['MSM_epflObj',['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html',1,'cv::datasets']]], - ['msm_5fmiddlebury_1025',['MSM_middlebury',['https://docs.opencv.org/4.2.0/d2/dcc/classcv_1_1datasets_1_1MSM__middlebury.html',1,'cv::datasets']]], - ['msm_5fmiddlebury_2ehpp_1026',['msm_middlebury.hpp',['https://docs.opencv.org/4.2.0/d6/d0b/msm__middlebury_8hpp.html',1,'']]], - ['msm_5fmiddleburyobj_1027',['MSM_middleburyObj',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1datasets_1_1MSM__middleburyObj.html',1,'cv::datasets']]], - ['mt19937_1028',['mt19937',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga887bdc65ea12ca4f83aa79f5bd9fce03',1,'std::mt19937'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga887bdc65ea12ca4f83aa79f5bd9fce03',1,'mt19937(Global Namespace)']]], - ['mt19937_5f64_1029',['mt19937_64',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga9606c7ecfbdedbd7ee5d8b908f4e2275',1,'std::mt19937_64'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga9606c7ecfbdedbd7ee5d8b908f4e2275',1,'mt19937_64(Global Namespace)']]], - ['mt_5fallocator_2eh_1030',['mt_allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01058.html',1,'']]], - ['mu_1031',['mu',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a0d807e56ef6d7a718c9bec8b86557b94',1,'cv::quality::QualitySSIM::_mat_data']]], - ['mu02_1032',['mu02',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#adcde8be49f73216d06965df0a884239b',1,'cv::Moments']]], - ['mu03_1033',['mu03',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#aa4072d2fd03bc6cdee8a5c0e15fe1b4f',1,'cv::Moments']]], - ['mu11_1034',['mu11',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a9afade2efe8ec13e8874acc43f274bf8',1,'cv::Moments']]], - ['mu12_1035',['mu12',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a811cdd7ac5c644f4678c3d9f1601b44d',1,'cv::Moments']]], - ['mu20_1036',['mu20',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a1f437e60fd477d2ea4b5a3f0c2b8a9d4',1,'cv::Moments']]], - ['mu21_1037',['mu21',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#aba659bac5ac0ff32cf3ad160d0d3b23e',1,'cv::Moments']]], - ['mu30_1038',['mu30',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a1fc9b5378cb0d4c0af043e991b79f96a',1,'cv::Moments']]], - ['mu_5f2_1039',['mu_2',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a32d0762845029dfb5ea76fd78daf8361',1,'cv::quality::QualitySSIM::_mat_data']]], - ['mul_1040',['mul',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a385c09827713dc3e6d713bfad8460706',1,'cv::Mat::mul()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0e80cbf0fa6ed1187294697ab2b674ca',1,'cv::MatExpr::mul(const MatExpr &e, double scale=1) const'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a3be890f1c079879bbd106050972f24ea',1,'cv::MatExpr::mul(const Mat &m, double scale=1) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'cv::Matx::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< _Tp, cn, 1 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 1, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 2, 2 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 2, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 3, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 3, 4 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 4, 4 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, cn, 1 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float, 2, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float, 3, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float, cn, 1 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float_type, 4, 4 >::mul()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a0ef9335f112158eed19fd91fac110414',1,'cv::Scalar_::mul()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a0ef9335f112158eed19fd91fac110414',1,'Scalar_< double >::mul()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#af50d8160ca05a304b30c1dd64ae20755',1,'cv::UMat::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'cv::Vec::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< _Tp, 4 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, 2 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, 3 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, 4 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, GPCPatchDescriptor::nFeatures >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, nFeatures >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< float, 2 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< float, 3 >::mul()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga42a8187b2bf350f90e4a31f93e929e51',1,'cv::gapi::mul()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga42a8187b2bf350f90e4a31f93e929e51',1,'mul()(Global Namespace)']]], - ['mul16s_1041',['mul16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8fb6f980b109edb1e4e0107334693ac9',1,'cv::hal::mul16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8fb6f980b109edb1e4e0107334693ac9',1,'mul16s()(Global Namespace)']]], - ['mul16u_1042',['mul16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga242229fc8cc1fe5f840c737fc8d27e77',1,'cv::hal::mul16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga242229fc8cc1fe5f840c737fc8d27e77',1,'mul16u()(Global Namespace)']]], - ['mul32f_1043',['mul32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1a577a4621637502343531e62aba9e4',1,'cv::hal::mul32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1a577a4621637502343531e62aba9e4',1,'mul32f()(Global Namespace)']]], - ['mul32s_1044',['mul32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga87426b5ce323eee5c97f92f082df8c5c',1,'cv::hal::mul32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga87426b5ce323eee5c97f92f082df8c5c',1,'mul32s()(Global Namespace)']]], - ['mul64f_1045',['mul64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38bd2b62ad3fa7906495708f82d16718',1,'cv::hal::mul64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38bd2b62ad3fa7906495708f82d16718',1,'mul64f()(Global Namespace)']]], - ['mul8s_1046',['mul8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacf694c2099ea3046ff44575570235fc4',1,'cv::hal::mul8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacf694c2099ea3046ff44575570235fc4',1,'mul8s()(Global Namespace)']]], - ['mul8u_1047',['mul8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3dd47e9d72de2668e8a1ae6b5ec99b29',1,'cv::hal::mul8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3dd47e9d72de2668e8a1ae6b5ec99b29',1,'mul8u()(Global Namespace)']]], - ['muladd_1048',['mulAdd',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafe33592336ab4182d98316e65a151ccd',1,'cv::mulAdd(const softfloat &a, const softfloat &b, const softfloat &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafd3f019e0be823233d1a74330e3b2849',1,'cv::mulAdd(const softdouble &a, const softdouble &b, const softdouble &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafe33592336ab4182d98316e65a151ccd',1,'mulAdd(const softfloat &a, const softfloat &b, const softfloat &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafd3f019e0be823233d1a74330e3b2849',1,'mulAdd(const softdouble &a, const softdouble &b, const softdouble &c)(Global Namespace)']]], - ['mulandscalespectrums_1049',['mulAndScaleSpectrums',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga5704c25b8be4f19da812e6d98c8ee464',1,'cv::cuda::mulAndScaleSpectrums()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga5704c25b8be4f19da812e6d98c8ee464',1,'mulAndScaleSpectrums()(Global Namespace)']]], - ['mulc_1050',['mulC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa924c8c082e0476e4d846843d5f8bed3',1,'cv::gapi::mulC(const GMat &src, double multiplier, int ddepth=-1)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga173028247b9426f6e744c18df02c10f1',1,'cv::gapi::mulC(const GMat &src, const GScalar &multiplier, int ddepth=-1)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga29ed07435c1ab0da02627303594a9b73',1,'cv::gapi::mulC(const GScalar &multiplier, const GMat &src, int ddepth=-1)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa924c8c082e0476e4d846843d5f8bed3',1,'mulC(const GMat &src, double multiplier, int ddepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga173028247b9426f6e744c18df02c10f1',1,'mulC(const GMat &src, const GScalar &multiplier, int ddepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga29ed07435c1ab0da02627303594a9b73',1,'mulC(const GScalar &multiplier, const GMat &src, int ddepth=-1)(Global Namespace)']]], - ['mulspectrums_1051',['mulSpectrums',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3ab38646463c59bf0ce962a9d51db64f',1,'cv::mulSpectrums()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#gab3e8900d67c4f59bdc137a0495206cd8',1,'cv::cuda::mulSpectrums()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3ab38646463c59bf0ce962a9d51db64f',1,'mulSpectrums(InputArray a, InputArray b, OutputArray c, int flags, bool conjB=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#gab3e8900d67c4f59bdc137a0495206cd8',1,'mulSpectrums(InputArray src1, InputArray src2, OutputArray dst, int flags, bool conjB=false, Stream &stream=Stream::Null())(Global Namespace)']]], - ['multi_20camera_20calibration_1052',['Multi-camera Calibration',['https://docs.opencv.org/4.2.0/d2/d1c/tutorial_multi_camera_main.html',1,'']]], - ['multi_20dimensional_20spaces_1053',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], - ['multi_20output_1054',['Upscaling images: multi-output',['https://docs.opencv.org/4.2.0/d6/dca/tutorial_dnn_superres_upscale_image_multi.html',1,'']]], - ['multi_20threading_1055',['Eigen and multi-threading',['https://eigen.tuxfamily.org/dox/TopicMultiThreading.html',1,'']]], - ['multi_5fband_1056',['MULTI_BAND',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#af4aa7ccea7ea77db1cead36f46ff6aafa2561f45ebefa078e121969723c3d2753',1,'cv::detail::Blender']]], - ['multi_5fcamera_5ftutorial_2emarkdown_1057',['multi_camera_tutorial.markdown',['https://docs.opencv.org/4.2.0/d3/d8e/multi__camera__tutorial_8markdown.html',1,'']]], - ['multi_5fstep_1058',['MULTI_STEP',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#gga6a4ee3a5f9fd35c1b350a1049d8abc9dac76aa06a768ef2d483abe5db77cabd39',1,'cv::ft::MULTI_STEP'],['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#gga6a4ee3a5f9fd35c1b350a1049d8abc9dac76aa06a768ef2d483abe5db77cabd39',1,'MULTI_STEP(Global Namespace)']]], - ['multibandblender_1059',['MultiBandBlender',['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html',1,'cv::detail::MultiBandBlender'],['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html#a22b424c9587d07da189cd1f15c664424',1,'cv::detail::MultiBandBlender::MultiBandBlender()']]], - ['multicalib_2ehpp_1060',['multicalib.hpp',['https://docs.opencv.org/4.2.0/d6/d51/multicalib_8hpp.html',1,'']]], - ['multicameracalibration_1061',['MultiCameraCalibration',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html',1,'cv::multicalib::MultiCameraCalibration'],['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#a8fefc924b521891bfe9affebefd2ccbc',1,'cv::multicalib::MultiCameraCalibration::MultiCameraCalibration()']]], - ['multimap_1062',['multimap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08731.html',1,'std::__debug::multimap< _Key, _Tp, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08927.html',1,'std::__profile::multimap< _Key, _Tp, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html',1,'std::multimap< _Key, _Tp, _Compare, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#acf3e6ab93785da86f181b584656de15d',1,'std::multimap::multimap()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1b00cb262efce13e4e5c323732c13109',1,'std::multimap::multimap(const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a75ee670e7ff1b74c62d3443ec05a9e4b',1,'std::multimap::multimap(const multimap &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#acbad3010aae4c8ce7ceb97ec5e2daff9',1,'std::multimap::multimap(multimap &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a64de4362141668b6b36fb6a399dbc9d4',1,'std::multimap::multimap(initializer_list< value_type > __l, const _Compare &__comp=_Compare(), const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a0ae31ea18b1274e6e6409795ae5286eb',1,'std::multimap::multimap(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a8105fc127e9fc15e90a050d7e0f7f11a',1,'std::multimap::multimap(const multimap &__m, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1093b678ea48aa26495ce2bbaf5dd4d7',1,'std::multimap::multimap(multimap &&__m, const allocator_type &__a) noexcept(is_nothrow_copy_constructible< _Compare >::value &&_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#aac222575af5d9600a5651357a978ecd6',1,'std::multimap::multimap(initializer_list< value_type > __l, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a4e1269440d1164dc556209ee07982358',1,'std::multimap::multimap(_InputIterator __first, _InputIterator __last, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ab2d27f68df308a944b432dbf91433e46',1,'std::multimap::multimap(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad11e806c3a5c1db4b888eac55459bbb3',1,'std::multimap::multimap(_InputIterator __first, _InputIterator __last, const _Compare &__comp, const allocator_type &__a=allocator_type())']]], - ['multiplication_1063',['Matrix multiplication',['https://docs.opencv.org/4.2.0/d2/dab/group__core__hal__interface__matrix__multiplication.html',1,'']]], - ['multiplier_1064',['multiplier',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a5f6ca5414f03b35e0a82731cf9cd6496',1,'std::linear_congruential_engine']]], - ['multiplies_1065',['multiplies',['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1cudev_1_1multiplies.html',1,'cv::cudev::multiplies< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07363.html',1,'std::multiplies< class >']]], - ['multiplies_3c_20void_20_3e_1066',['multiplies< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07387.html',1,'std']]], - ['multiply_1067',['multiply',['https://docs.opencv.org/4.2.0/de/db7/group__core__hal__interface__multiply.html',1,'Element-wise multiply'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ac5a4ac08519b8229bfa99fba68f3bdc2',1,'cv::MatOp::multiply(const MatExpr &expr1, const MatExpr &expr2, MatExpr &res, double scale=1) const'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a5c992cafa34003955815dcaf95f5e745',1,'cv::MatOp::multiply(const MatExpr &expr1, double s, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga979d898a58d7f61c53003e162e7ad89f',1,'cv::multiply()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga497cc0615bf717e1e615143b56f00591',1,'cv::cuda::multiply()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga979d898a58d7f61c53003e162e7ad89f',1,'multiply(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga497cc0615bf717e1e615143b56f00591',1,'multiply(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1, Stream &stream=Stream::Null())(Global Namespace)']]], - ['multiprocessorcount_1068',['multiProcessorCount',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8b4c6b2aed8ee5285bff0e42746fa363',1,'cv::cuda::DeviceInfo']]], - ['multisensorekf_1069',['MultiSensorEKF',['../classfilters_1_1MultiSensorEKF.html',1,'filters']]], - ['multiseq_5fpartition_1070',['multiseq_partition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ade1f4c5da0794c4f1a09465d4aee6c1d',1,'__gnu_parallel']]], - ['multiseq_5fselection_1071',['multiseq_selection',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a68f665a2f83172d9e12b8332ce573d5d',1,'__gnu_parallel']]], - ['multiseq_5fselection_2eh_1072',['multiseq_selection.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00920.html',1,'']]], - ['multiset_1073',['multiset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08735.html',1,'std::__debug::multiset< _Key, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08931.html',1,'std::__profile::multiset< _Key, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html',1,'std::multiset< _Key, _Compare, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a694c6f511cd8cd15e116062bcaef1dc4',1,'std::multiset::multiset()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a38e27d171934c562e8f5fc48fba81564',1,'std::multiset::multiset(const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ac561d1612797aaf6022b371cce116035',1,'std::multiset::multiset(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae6acd6b5095c21d2a04c7d9afa6b02ab',1,'std::multiset::multiset(_InputIterator __first, _InputIterator __last, const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aeed9cc573fe8a3346634b3f28dda12a2',1,'std::multiset::multiset(const multiset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a851d2cffcf7183d7a16423d4964f8047',1,'std::multiset::multiset(multiset &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#adad316ede7ac22b3eff955eb6d9ab327',1,'std::multiset::multiset(initializer_list< value_type > __l, const _Compare &__comp=_Compare(), const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae8a1847b51c056d1abbc01fb76742632',1,'std::multiset::multiset(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a3ada945ca3237945e666bdc541accba1',1,'std::multiset::multiset(const multiset &__m, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a0bf2a4cf104ce19a863ac0438e1d3070',1,'std::multiset::multiset(multiset &&__m, const allocator_type &__a) noexcept(is_nothrow_copy_constructible< _Compare >::value &&_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a4bd596fbcfa91841dc0bfe442177c5ac',1,'std::multiset::multiset(initializer_list< value_type > __l, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a15b3f5d46a91d60ee98c0ac7f278476a',1,'std::multiset::multiset(_InputIterator __first, _InputIterator __last, const allocator_type &__a)']]], - ['multitracker_1074',['MultiTracker',['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html',1,'cv::MultiTracker'],['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html#a919f18c31b860b5b20e372881b9f2265',1,'cv::MultiTracker::MultiTracker()'],['https://docs.opencv.org/4.2.0/d5/d07/tutorial_multitracker.html',1,'Using MultiTracker']]], - ['multitracker_5falt_1075',['MultiTracker_Alt',['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html',1,'cv::MultiTracker_Alt'],['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html#a24a9ebc9e0753576a13f8437e88b08e0',1,'cv::MultiTracker_Alt::MultiTracker_Alt()']]], - ['multitrackertld_1076',['MultiTrackerTLD',['https://docs.opencv.org/4.2.0/d2/d33/classcv_1_1MultiTrackerTLD.html',1,'cv']]], - ['multiview_20stereo_20matching_1077',['Multiview Stereo Matching',['https://docs.opencv.org/4.2.0/d7/dd5/group__datasets__msm.html',1,'']]], - ['multiway_5fmerge_1078',['multiway_merge',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a25294b0a47406aefa9ebc5e0c151d0ce',1,'__gnu_parallel']]], - ['multiway_5fmerge_2eh_1079',['multiway_merge.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00923.html',1,'']]], - ['multiway_5fmerge_5f3_5fvariant_1080',['multiway_merge_3_variant',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a7ee9d79b73a6f85ae97e472312ba411e',1,'__gnu_parallel']]], - ['multiway_5fmerge_5f4_5fvariant_1081',['multiway_merge_4_variant',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ac4af8f9977aa36823357bce35be6c946',1,'__gnu_parallel']]], - ['multiway_5fmerge_5fexact_5fsplitting_1082',['multiway_merge_exact_splitting',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a567621588e461a8759651e29cd964ab9',1,'__gnu_parallel']]], - ['multiway_5fmerge_5floser_5ftree_1083',['multiway_merge_loser_tree',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a150b06a4da2cf1cff673d1b6242c27fa',1,'__gnu_parallel']]], - ['multiway_5fmerge_5floser_5ftree_5fsentinel_1084',['multiway_merge_loser_tree_sentinel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a686704fa4da0a4fdbc6800fe46048366',1,'__gnu_parallel']]], - ['multiway_5fmerge_5floser_5ftree_5funguarded_1085',['multiway_merge_loser_tree_unguarded',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a3ffd0c9da50da6118291d38f95d44b52',1,'__gnu_parallel']]], - ['multiway_5fmerge_5fminimal_5fk_1086',['multiway_merge_minimal_k',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a4859415fa2642fbdf9324007b75b020e',1,'__gnu_parallel::_Settings']]], - ['multiway_5fmerge_5fminimal_5fn_1087',['multiway_merge_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a15bef2dad4920451b8eb798ccdbf68f8',1,'__gnu_parallel::_Settings']]], - ['multiway_5fmerge_5foversampling_1088',['multiway_merge_oversampling',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#aa514e4bd6da6380bf7526c5306d6b173',1,'__gnu_parallel::_Settings']]], - ['multiway_5fmerge_5fsampling_5fsplitting_1089',['multiway_merge_sampling_splitting',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a0e39d3891745fd0e244fb125bf34ce8b',1,'__gnu_parallel']]], - ['multiway_5fmerge_5fsentinels_1090',['multiway_merge_sentinels',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a4d6e76ac42b48f0033139352dcb0418f',1,'__gnu_parallel']]], - ['multiway_5fmergesort_2eh_1091',['multiway_mergesort.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00926.html',1,'']]], - ['multiway_5fmergesort_5fexact_5ftag_1092',['multiway_mergesort_exact_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09747.html',1,'__gnu_parallel']]], - ['multiway_5fmergesort_5fsampling_5ftag_1093',['multiway_mergesort_sampling_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09751.html',1,'__gnu_parallel']]], - ['multiway_5fmergesort_5ftag_1094',['multiway_mergesort_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09743.html',1,'__gnu_parallel']]], - ['multransposed_1095',['mulTransposed',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadc4e49f8f7a155044e3be1b9e3b270ab',1,'cv::mulTransposed()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadc4e49f8f7a155044e3be1b9e3b270ab',1,'mulTransposed()(Global Namespace)']]], - ['mustestimatetrimaratio_1096',['mustEstimateTrimaRatio',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a39dbf002bfc87325c45726288c278b97',1,'cv::videostab::TwoPassStabilizer']]], - ['mustesttrimratio_5f_1097',['mustEstTrimRatio_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a590f1fb1c89bb92f1e3a47ae11bc61c4',1,'cv::videostab::TwoPassStabilizer']]], - ['mutating_1098',['Mutating',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html',1,'Mutating'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html',1,'Non-Mutating']]], - ['mutex_1099',['mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07191.html',1,'std::mutex'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00110.html',1,'(Global Namespace)']]], - ['mutex_1100',['Mutex',['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1utils_1_1lock__guard.html#aae883527d92cd4f675ec3ca71c3aaded',1,'cv::utils::lock_guard::Mutex'],['https://docs.opencv.org/4.2.0/d3/de8/classcv_1_1utils_1_1optional__lock__guard.html#a8adcabd3c8ee339c470662537e7d6d4e',1,'cv::utils::optional_lock_guard::Mutex'],['https://docs.opencv.org/4.2.0/d2/ddd/classcv_1_1utils_1_1optional__shared__lock__guard.html#ae4ac3ec60432043b4bbe8ed9be247e2a',1,'cv::utils::optional_shared_lock_guard::Mutex'],['https://docs.opencv.org/4.2.0/d9/d7f/classcv_1_1utils_1_1shared__lock__guard.html#a873b9d2ace40c6d53b1fa192144c8528',1,'cv::utils::shared_lock_guard::Mutex'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf0b2df4f7899189c9d04f7a2c2559132',1,'cv::Mutex'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf0b2df4f7899189c9d04f7a2c2559132',1,'Mutex(Global Namespace)']]], - ['mutex_5f_1101',['mutex_',['https://docs.opencv.org/4.2.0/d2/ddd/classcv_1_1utils_1_1optional__shared__lock__guard.html#a9e8a790ebcf555301c94cb04022fb016',1,'cv::utils::optional_shared_lock_guard::mutex_'],['https://docs.opencv.org/4.2.0/d9/d7f/classcv_1_1utils_1_1shared__lock__guard.html#ab44a1a18cfef499c573ebc4acd44397d',1,'cv::utils::shared_lock_guard::mutex_']]], - ['mutexes_1102',['Mutexes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html',1,'']]], - ['mvkernel_1103',['MVKernel',['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html',1,'cv::stereo::MVKernel< num_images >'],['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#a9c14f938c0384395f268d3caa1211c41',1,'cv::stereo::MVKernel::MVKernel()'],['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#ad5be80bc8561c20b861bac19d54bf993',1,'cv::stereo::MVKernel::MVKernel(uint8_t **images, int **integral)']]], - ['mvnlayer_1104',['MVNLayer',['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html',1,'cv::dnn']]], - ['mysum_1105',['mySum',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a837849d3551e7b76e6f67d602b37ecd1',1,'cv::cudev::NormHamming::mySum'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#ad0cb3f5cd921d2ce68a6c1c109bf2ddc',1,'cv::cudev::NormL1::mySum'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#ae34ebae2fa946238cfff562ad52f543f',1,'cv::cudev::NormL1< float >::mySum'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#a9f5a7088b96f05fd624caae1d041c2d5',1,'cv::cudev::NormL2::mySum']]] + ['memoptypetostr_682',['memopTypeToStr',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga3a8b3c8a8991e15ac4e4aa2a007bb2ea',1,'cv::ocl::memopTypeToStr()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga3a8b3c8a8991e15ac4e4aa2a007bb2ea',1,'memopTypeToStr()(Global Namespace)']]], + ['memory_683',['MEMORY',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482dabdde7670c9c7e472f8445932ea7cbbf7',1,'cv::FileStorage']]], + ['memory_684',['Memory',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01480.html',1,'']]], + ['memory_685',['memory',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00107.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ac2d4047459c677a9369c27e277484973',1,'cv::util::variant::memory'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ac2d4047459c677a9369c27e277484973',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::memory']]], + ['memory_20images_20in_20the_20visual_20studio_20debugger_686',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['memory_5forder_687',['memory_order',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gab4f8c60de95c10793a8e3e27fcb800d9',1,'std::memory_order'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gab4f8c60de95c10793a8e3e27fcb800d9',1,'memory_order(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga7163c4f13e7624eb78b16bb599a72f98',1,'std::memory_order'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga7163c4f13e7624eb78b16bb599a72f98',1,'memory_order(Global Namespace)']]], + ['memory_5fresource_688',['memory_resource',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01013.html',1,'']]], + ['memorybuswidth_689',['memoryBusWidth',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#adc029e9b7100063a9646a50435f55ed3',1,'cv::cuda::DeviceInfo']]], + ['memoryclockrate_690',['memoryClockRate',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a014f96fb7cd5639480347e7de85686be',1,'cv::cuda::DeviceInfo']]], + ['memoryflag_691',['MemoryFlag',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12',1,'cv::UMatData']]], + ['memoryfwd_2eh_692',['memoryfwd.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00422.html',1,'']]], + ['mempitch_693',['memPitch',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ac9923f30632f9a587a0d5f971fdfaf62',1,'cv::cuda::DeviceInfo']]], + ['memsegcopyhelper_694',['memSegCopyHelper',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga75faff2ec1d14c63918ee02e74e988cc',1,]]], + ['memsegcopyhelper2d_695',['memSegCopyHelper2D',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga253a695ab7a336ebb07008593565cd4c',1,]]], + ['memtype_696',['memType',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#af8070dc8c7faee07938281306cacf0c8',1,'INCVMemAllocator::memType()'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#a11fb3dc94bd7225421630e4491e226bb',1,'NCVMatrix::memType()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#af82dd02192ab82e59eb264a8c0aee539',1,'NCVMemNativeAllocator::memType()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#ae28f33a2fb00ad0f9e0ed4ba7d48bc34',1,'NCVMemStackAllocator::memType()'],['https://docs.opencv.org/4.2.0/dc/d73/classNCVVector.html#a6b686f2701af81ddd34aa121246bca01',1,'NCVVector::memType()']]], + ['memtype_697',['memtype',['https://docs.opencv.org/4.2.0/d6/d86/structNCVMemPtr.html#a315eb985d5ea3d3fa803a8882e5d4daa',1,'NCVMemPtr']]], + ['mercatorprojector_698',['MercatorProjector',['https://docs.opencv.org/4.2.0/d1/daa/structcv_1_1detail_1_1MercatorProjector.html',1,'cv::detail']]], + ['mercatorwarper_699',['MercatorWarper',['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1detail_1_1MercatorWarper.html',1,'cv::detail::MercatorWarper'],['https://docs.opencv.org/4.2.0/de/d04/classcv_1_1MercatorWarper.html',1,'cv::MercatorWarper'],['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1detail_1_1MercatorWarper.html#a3db79c1c7a45176cd58da433556769c9',1,'cv::detail::MercatorWarper::MercatorWarper()']]], + ['merge_700',['merge',['https://docs.opencv.org/4.2.0/df/d2e/group__core__hal__interface__merge.html',1,'Channel merge'],['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategy.html#a161d214c83db7e0dc0812dabed6674fb',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentationStrategy::merge()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4d6a44991e6e9a4f1d74236e7d6fc012',1,'list< __inp, __rebind_inp >::merge(list &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a44306154a6f093d8168eff45b90aa3ad',1,'list< __inp, __rebind_inp >::merge(list &&__x, _StrictWeakOrdering __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a4794e46af448c443019e9b36640744ab',1,'std::forward_list::merge(forward_list &&__list)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a0de7b075b73cc0a843447ad75cba4b87',1,'std::forward_list::merge(forward_list &&__list, _Comp __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4d6a44991e6e9a4f1d74236e7d6fc012',1,'std::list::merge(list &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a44306154a6f093d8168eff45b90aa3ad',1,'std::list::merge(list &&__x, _StrictWeakOrdering __comp)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7d7b4d6c6ee504b30a20b1680029c7b4',1,'cv::merge(const Mat *mv, size_t count, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga61f2f2bde4a0a0154b2333ea504fab1d',1,'cv::merge(InputArrayOfArrays mv, OutputArray dst)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaac939dc3b178ee92fb6e7078f342622c',1,'cv::cuda::merge(const GpuMat *src, size_t n, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gafce19eb0fcad23f67ab45d544992436d',1,'cv::cuda::merge(const std::vector< GpuMat > &src, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7d7b4d6c6ee504b30a20b1680029c7b4',1,'merge(const Mat *mv, size_t count, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga61f2f2bde4a0a0154b2333ea504fab1d',1,'merge(InputArrayOfArrays mv, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaac939dc3b178ee92fb6e7078f342622c',1,'merge(const GpuMat *src, size_t n, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gafce19eb0fcad23f67ab45d544992436d',1,'merge(const std::vector< GpuMat > &src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabb18bc670a27e539246a2eb154f60351',1,'std::merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7f7771648d074e296d019153633efa8d',1,'std::merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabb18bc670a27e539246a2eb154f60351',1,'merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7f7771648d074e296d019153633efa8d',1,'merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)(Global Namespace)']]], + ['merge_2eh_701',['merge.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00917.html',1,'']]], + ['merge16u_702',['merge16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf3380647212f442cdc89ada0d26e5dd1',1,'cv::hal::merge16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf3380647212f442cdc89ada0d26e5dd1',1,'merge16u()(Global Namespace)']]], + ['merge3_703',['merge3',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaf63e894270a088695e6ec97d9a903971',1,'cv::gapi::merge3()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaf63e894270a088695e6ec97d9a903971',1,'merge3()(Global Namespace)']]], + ['merge32s_704',['merge32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6d608cfae074f0f75db7e7f4e760be0f',1,'cv::hal::merge32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6d608cfae074f0f75db7e7f4e760be0f',1,'merge32s()(Global Namespace)']]], + ['merge4_705',['merge4',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga8206d42b933edcbf08d6953e202d0dd0',1,'cv::gapi::merge4()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga8206d42b933edcbf08d6953e202d0dd0',1,'merge4()(Global Namespace)']]], + ['merge64s_706',['merge64s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5e717dd8d0a41c6c06793ab9308c8fc6',1,'cv::hal::merge64s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5e717dd8d0a41c6c06793ab9308c8fc6',1,'merge64s()(Global Namespace)']]], + ['merge8u_707',['merge8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6b834e84af204ef9becc0805dca5caab',1,'cv::hal::merge8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6b834e84af204ef9becc0805dca5caab',1,'merge8u()(Global Namespace)']]], + ['merge_5fminimal_5fn_708',['merge_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a6daa1846a1a935cd6ec684087e063ac4',1,'__gnu_parallel::_Settings']]], + ['merge_5foversampling_709',['merge_oversampling',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a14ded8ea54764e899f1d24ef1fe12b19',1,'__gnu_parallel::_Settings']]], + ['merge_5fpatch_710',['merge_patch',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a844a77cb154752d12118f10af26d54cb.html#a844a77cb154752d12118f10af26d54cb',1,'nlohmann::basic_json']]], + ['merged_711',['merged',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a59eb62d949598853fbc83836e8f2960c',1,'Eigen::AlignedBox']]], + ['mergeddescriptors_712',['mergedDescriptors',['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#af89f9c161a310152714934252aef681f',1,'cv::DescriptorMatcher::DescriptorCollection::mergedDescriptors'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a990859c4f84b04b3ced4411b3a62e7cc',1,'cv::FlannBasedMatcher::mergedDescriptors']]], + ['mergedebevec_713',['MergeDebevec',['https://docs.opencv.org/4.2.0/df/d62/classcv_1_1MergeDebevec.html',1,'cv']]], + ['mergeexposures_714',['MergeExposures',['https://docs.opencv.org/4.2.0/d6/d5e/classcv_1_1MergeExposures.html',1,'cv']]], + ['mergemertens_715',['MergeMertens',['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html',1,'cv']]], + ['mergerobertson_716',['MergeRobertson',['https://docs.opencv.org/4.2.0/d7/d5b/classcv_1_1MergeRobertson.html',1,'cv']]], + ['mergesets_717',['mergeSets',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#ace5164c3b1500421c96c7b6cc4dfaa9d',1,'cv::detail::DisjointSets']]], + ['mersenne_5ftwister_5fengine_718',['mersenne_twister_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html',1,'std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8987d5bb70c31ba8e4bb80f993acff85',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::mersenne_twister_engine()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8987d5bb70c31ba8e4bb80f993acff85',1,'std::mersenne_twister_engine::mersenne_twister_engine()']]], + ['mersenne_5ftwister_5fengine_3c_20uint_5ffast32_5ft_2c_2032_2c_20624_2c_20397_2c_2031_2c_200x9908b0dful_2c_2011_2c_200xfffffffful_2c_207_2c_200x9d2c5680ul_2c_2015_2c_200xefc60000ul_2c_2018_2c_201812433253ul_20_3e_719',['mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html',1,'']]], + ['mesh_720',['Mesh',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html',1,'cv::viz']]], + ['messages_721',['messages',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html',1,'std::messages< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a7cfad8ee6c5f1275b9862c63bd5d5241',1,'std::locale::messages'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a71483d79d47eaf8f3739c4b6b971b00e',1,'std::messages::messages(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a8cfe4d6b3be654727ca4f705c27b3d51',1,'std::messages::messages(__c_locale __cloc, const char *__s, size_t __refs=0)']]], + ['messages_5fbase_722',['messages_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06031.html',1,'std']]], + ['messages_5fbyname_723',['messages_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06039.html',1,'std']]], + ['messages_5fmembers_2eh_724',['messages_members.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00710.html',1,'']]], + ['meta_725',['meta',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#acd5da358f7568c97824b029596f92b11',1,'cv::gapi::fluid::Buffer::meta()'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#a0b7410b59963f6fb33bdc2a45c518960',1,'cv::gapi::fluid::View::meta()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a351b4f65014f6c2b8b2832847d44bbd7.html#a351b4f65014f6c2b8b2832847d44bbd7',1,'nlohmann::basic_json::meta()']]], + ['meta_20module_726',['Sparse meta-module',['https://eigen.tuxfamily.org/dox/group__Sparse__Module.html',1,'']]], + ['metadata_20descriptors_727',['G-API Metadata Descriptors',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html',1,'']]], + ['metadata_5fconst_5freference_728',['metadata_const_reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a1cc97219243280077e011641b5a34d7c',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::metadata_const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a1cc97219243280077e011641b5a34d7c',1,'__gnu_pbds::detail::bin_search_tree_node_it_::metadata_const_reference']]], + ['metadata_5freference_729',['metadata_reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#a9b1f819009fec959d74668594f98852d',1,'__gnu_pbds::lu_counter_policy::metadata_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html#abed5686c84f4f62f95894f692a53fedf',1,'__gnu_pbds::lu_move_to_front_policy::metadata_reference']]], + ['metadata_5ftype_730',['metadata_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7eb0036cd037c9139ab0019c557be22d',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::metadata_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7eb0036cd037c9139ab0019c557be22d',1,'__gnu_pbds::detail::bin_search_tree_node_it_::metadata_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a28fd8a987e41c1d2f3d413b8018f7957',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::metadata_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a28fd8a987e41c1d2f3d413b8018f7957',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::metadata_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#aa53180229ff61fd4f105cd893740b12d',1,'__gnu_pbds::lu_counter_policy::metadata_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html#acfcd460068d88a84f3931c05942fd979',1,'__gnu_pbds::lu_move_to_front_policy::metadata_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#ae04b006c23ec3b6064311bd1df20ba8c',1,'__gnu_pbds::sample_update_policy::metadata_type']]], + ['metahelper_731',['MetaHelper',['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1MetaHelper.html',1,'cv::detail']]], + ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20args_2e_2e_2e_20_3e_2c_20r_20_3e_732',['MetaHelper< K, std::tuple< Args... >, R >',['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1MetaHelper.html',1,'']]], + ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20args_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20r_2e_2e_2e_20_3e_20_3e_733',['MetaHelper< K, std::tuple< Args... >, std::tuple< R... > >',['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1MetaHelper.html',1,'']]], + ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20out_20_3e_734',['MetaHelper< K, std::tuple< Ins... >, Out >',['https://docs.opencv.org/4.2.0/db/dff/structcv_1_1detail_1_1MetaHelper_3_01K_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01Out_01_4.html',1,'cv::detail']]], + ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20outs_2e_2e_2e_20_3e_20_3e_735',['MetaHelper< K, std::tuple< Ins... >, std::tuple< Outs... > >',['https://docs.opencv.org/4.2.0/d1/dde/structcv_1_1detail_1_1MetaHelper_3_01K_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_1tuple_3_01Outs_8_8_8_01_4_01_4.html',1,'cv::detail']]], + ['metaprogramming_736',['Metaprogramming',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html',1,'']]], + ['metas_737',['metas',['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ae105107abedd589e94153a0e6f916367',1,'cv::GCompiled::metas()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#a027d4aa5e0fef550fe7389984482b3a5',1,'cv::GStreamingCompiled::metas()']]], + ['metatype_738',['MetaType',['https://docs.opencv.org/4.2.0/db/d79/structcv_1_1detail_1_1MetaType.html',1,'cv::detail']]], + ['metatype_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_739',['MetaType< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/d4/d91/structcv_1_1detail_1_1MetaType_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], + ['metatype_3c_20cv_3a_3agmat_20_3e_740',['MetaType< cv::GMat >',['https://docs.opencv.org/4.2.0/d0/dcf/structcv_1_1detail_1_1MetaType_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], + ['metatype_3c_20cv_3a_3agmatp_20_3e_741',['MetaType< cv::GMatP >',['https://docs.opencv.org/4.2.0/dc/d9f/structcv_1_1detail_1_1MetaType_3_01cv_1_1GMatP_01_4.html',1,'cv::detail']]], + ['metatype_3c_20cv_3a_3agscalar_20_3e_742',['MetaType< cv::GScalar >',['https://docs.opencv.org/4.2.0/de/d91/structcv_1_1detail_1_1MetaType_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], + ['meterstogps_743',['metersToGPS',['../classGPSToMetersConverter.html#a434ba240ca25217c058cfa2b3f58b68d',1,'GPSToMetersConverter']]], + ['method_744',['Fast Marching Method',['https://docs.opencv.org/4.2.0/db/d18/group__videostab__marching.html',1,'']]], + ['method_5f_745',['method_',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#aede8d82640760ef005cdbee8b23349f4',1,'cv::rgbd::DepthCleaner::method_'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#af2c4bd93cb03e77618c6c6aa1fb70ee6',1,'cv::rgbd::RgbdNormals::method_']]], + ['methodid_746',['methodId',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#afbbc6da65b06b05e696bfa95b3326f52',1,'cv::structured_light::SinusoidalPattern::Params']]], + ['methods_747',['Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'How to Use Background Subtraction Methods'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'Improved Background-Foreground Segmentation Methods'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a11394898c4732995dd3af8a665f92894',1,'cv::ml::LogisticRegression::Methods']]], + ['metisordering_748',['MetisOrdering',['https://eigen.tuxfamily.org/dox/classEigen_1_1MetisOrdering.html',1,'Eigen']]], + ['metissupport_20module_749',['MetisSupport module',['https://eigen.tuxfamily.org/dox/group__MetisSupport__Module.html',1,'']]], + ['microseconds_750',['microseconds',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#a4b023048c2f5e3644ccc58a80ae381ad',1,'std::chrono']]], + ['microsoft_20visual_20studio_751',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['middlebutton_752',['MiddleButton',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#ada240f2528500ad1615e76fb2fd9e2baacd85df21decb225a207beaca4c1a3778',1,'cv::viz::MouseEvent']]], + ['milliseconds_753',['milliseconds',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#a979a98673e4244630e142461b1026d74',1,'std::chrono']]], + ['min_754',['Min',['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1Min.html',1,'cv::cudev::Min< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a600b5a58e77104ef7281dba6dcffb808',1,'Eigen::AlignedBox::Min']]], + ['min_755',['min',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac22d7d32f1ec91fd106760a98a6f4731',1,'cv::MatExpr::min(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aafbfd6a44196ca5f40bcea5136548c22',1,'cv::MatExpr::min(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a865832a7380156566594f039d4ff0ff6',1,'cv::MatExpr::min(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6fdbec4b3fdb2b23f1d79bc73640d371',1,'cv::MatExpr::min(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a176d14d2ffed87f4e024d4933104a2bb',1,'cv::MatExpr::min(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac22d7d32f1ec91fd106760a98a6f4731',1,'cv::MatExpr::min(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aafbfd6a44196ca5f40bcea5136548c22',1,'cv::MatExpr::min(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a865832a7380156566594f039d4ff0ff6',1,'cv::MatExpr::min(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6fdbec4b3fdb2b23f1d79bc73640d371',1,'cv::MatExpr::min(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a176d14d2ffed87f4e024d4933104a2bb',1,'cv::MatExpr::min(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/da/d81/structcv_1_1cudev_1_1numeric__limits_3_01bool_01_4.html#a359fab492885fe351389d0f3b99e304a',1,'cv::cudev::numeric_limits< bool >::min()'],['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html#a079f77010993f609c5834184a3fc571e',1,'cv::cudev::numeric_limits< double >::min()'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html#aea8ce5e57cd0c36d0ca81a523e0640a1',1,'cv::cudev::numeric_limits< float >::min()'],['https://docs.opencv.org/4.2.0/da/d4e/structcv_1_1cudev_1_1numeric__limits_3_01schar_01_4.html#a22dd9ab6b9d4491a33a70c432e868187',1,'cv::cudev::numeric_limits< schar >::min()'],['https://docs.opencv.org/4.2.0/d1/d8b/structcv_1_1cudev_1_1numeric__limits_3_01short_01_4.html#a63563af1d24632a4b6d62cc168d54a06',1,'cv::cudev::numeric_limits< short >::min()'],['https://docs.opencv.org/4.2.0/d3/dc7/structcv_1_1cudev_1_1numeric__limits_3_01uchar_01_4.html#aac19eaa31ded65f911830b3f45e4e5ba',1,'cv::cudev::numeric_limits< uchar >::min()'],['https://docs.opencv.org/4.2.0/dd/d89/structcv_1_1cudev_1_1numeric__limits_3_01uint_01_4.html#ab9f226ae2e962a64a9ba9d89e1ecf288',1,'cv::cudev::numeric_limits< uint >::min()'],['https://docs.opencv.org/4.2.0/df/d47/structcv_1_1cudev_1_1numeric__limits_3_01ushort_01_4.html#a541b9509bbd6782ccf98bf2abc68380b',1,'cv::cudev::numeric_limits< ushort >::min()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9a426dcd6be0bd77995b636fe291e6d0',1,'cv::softdouble::min()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga2473116e9ce9a101a7e6ed53753df9b6',1,'cv::softfloat::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a7dc4b8a5f0edcf447683b93607a8441e',1,'gamma_distribution< double >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a7dc4b8a5f0edcf447683b93607a8441e',1,'gamma_distribution< result_type >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#aaf1720ef1664fa77a5972c78addfa290',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#aa79e79b65edcb6f45dda08b3efdff9e8',1,'normal_distribution< double >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#aa79e79b65edcb6f45dda08b3efdff9e8',1,'normal_distribution< result_type >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#acfd63c2f93e6215cd8304db6f5c39df4',1,'std::bernoulli_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a0dcaff746d5993e73b30cbbc70afbd05',1,'std::binomial_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#a93cbd65b4fa6d5a84149a0db63c7e10c',1,'std::cauchy_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a71039379ac60b7df94b625c4a45cb287',1,'std::chi_squared_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a16286565620fc6966ca53540572ede38',1,'std::discard_block_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a2ea8319bc859527d8a4f22380ab85672',1,'std::discrete_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a21226cd61a367799a695c438f6c0af26',1,'std::exponential_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#aa97af0bfaca27148976ef1a65ab257c5',1,'std::extreme_value_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a7b129ca3a6af6d6d063ecde317361ef8',1,'std::fisher_f_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a7dc4b8a5f0edcf447683b93607a8441e',1,'std::gamma_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#af711039331910d5b184bfcdb43e4e12b',1,'std::geometric_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a5900ce9b2214d848cce14cb82ce71397',1,'std::independent_bits_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a57c283a281f9b007e0a7659b57586f52',1,'std::linear_congruential_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#aa6d60ac02923738e93e5cc2813d9cfea',1,'std::lognormal_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#aaf1720ef1664fa77a5972c78addfa290',1,'std::mersenne_twister_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#ab4c3074bd3f87187e7de81a5ece8522c',1,'std::negative_binomial_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#aa79e79b65edcb6f45dda08b3efdff9e8',1,'std::normal_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#aae25581f91ebab83161d2da3fe0cdb9d',1,'std::numeric_limits::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a1d4e28300518616fef3f4b93a3d1d10d',1,'std::piecewise_constant_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#adaf7520277cc879942d011de156dc184',1,'std::piecewise_linear_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#afb49039795f3c63e256f6b4d2cfab433',1,'std::poisson_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a113fdc5d67d45435e869a9e905a3c658',1,'std::shuffle_order_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a40bd6b63baec90b927fc13bb5d3b2bba',1,'std::student_t_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a945725b8377db61951fc9c79a0f9aac1',1,'std::subtract_with_carry_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a6e74f2a2cb1d736ac814efd4691f7fe0',1,'std::uniform_int_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#a7e6fbfe7a4278ebf8a85cb9b4afa6ec2',1,'std::uniform_real_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41cf9f2fac24470499589628f657be67',1,'std::valarray::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a3060d7ec6a83eb719429f3a0677705ff',1,'std::weibull_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41cf9f2fac24470499589628f657be67',1,'valarray< size_t >::min()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#adad123f7e84a2437806a791b96af04bd',1,'Eigen::AlignedBox::min()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#af7fddcf06b60392f3f21b4d8e0f763a0',1,'Eigen::AlignedBox::min() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac48df53b8fd34b87e7b121fa8fd4c379',1,'cv::min(const softfloat &a, const softfloat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf625702f70e571f33784b0652be9a7b7',1,'cv::min(const softdouble &a, const softdouble &b)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9af368f182ee76d0463d0d8d5330b764',1,'cv::min(InputArray src1, InputArray src2, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0b8852cd1a92366860e390e8abbe78dc',1,'cv::min(const Mat &src1, const Mat &src2, Mat &dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa83bf3dce9a4a488675347fff6692cb9',1,'cv::min(const UMat &src1, const UMat &src2, UMat &dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga74f0b05a65b3d949c237abb5e6c60867',1,'cv::cuda::min()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166301154ec0c6fb8859c8126e013fac',1,'cv::cudev::min(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37cfadd8b02bc1989b2ff264d915a6b',1,'cv::cudev::min(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e7580e80893052d84dfb5ec5ca5f766',1,'cv::cudev::min(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99931470f4d68820bbc5459ed795da8d',1,'cv::cudev::min(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f515695538396fb8648b71901d058d',1,'cv::cudev::min(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad2901b8dd9a2efa1ea3a075ddf2d3f8',1,'cv::cudev::min(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga580140f65047fb3188cd74f2d0f69a08',1,'cv::cudev::min(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf199b5514de7c6a6af1b2c73c5725b7b',1,'cv::cudev::min(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa618ba2f3832b30d643cce7efa62a04c',1,'cv::cudev::min(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c687dbc301bada436f1b666ac1ad4de',1,'cv::cudev::min(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad638c54878b6ccf16f85915845369fb8',1,'cv::cudev::min(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77ec7dd3c8bf8d93adb1a0ae89226dc0',1,'cv::cudev::min(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68ba59a2fd07a335aa566788ae5b6dd8',1,'cv::cudev::min(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga570aa1a8375e90a96942ba5a9d73a8b9',1,'cv::cudev::min(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c5a8171954561ee7d86bad9a5b69ca',1,'cv::cudev::min(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d89f72aa99839fa446920cee353de8',1,'cv::cudev::min(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad897218ccbbb0e9cc8660213479afad2',1,'cv::cudev::min(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga211f9a750f17f04c671e1ecff782d3b0',1,'cv::cudev::min(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga534ff33d0fb6a9f231c45e11ec109c06',1,'cv::cudev::min(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76547c7e7ce1e38e4bfbc95c41f211a9',1,'cv::cudev::min(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f48115719f2492736e6c1e6e54b47bc',1,'cv::cudev::min(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea84f0591c4aa8110ee233fd83f3b2e7',1,'cv::cudev::min(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29bc62147e04bbc4d5cc713722b3ebc7',1,'cv::cudev::min(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a27832d49d358b841977db8ac614fe',1,'cv::cudev::min(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga874939daee476a502f9e25a60d11a0af',1,'cv::cudev::min(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17b5b845d773a38304e10c6f6ef7a63b',1,'cv::cudev::min(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40ba01d1818bae80a0b25cced8a91b0e',1,'cv::cudev::min(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ea00427d284684a5381f925c8865413',1,'cv::cudev::min(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e3b6cc4c9f631582962e2e8a570974',1,'cv::cudev::min(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cbeba62c9983bec445ede74fe15c5d',1,'cv::cudev::min(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a26ede9e7b8aff8af95843ae065a3d6',1,'cv::cudev::min(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3b5b82737560408526a05e60a01cf0c',1,'cv::cudev::min(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50b5e9c2bd4b51a9ca871a2affbab6be',1,'cv::cudev::min(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bc7c6f847a6b03438d75ad28b20e50',1,'cv::cudev::min(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5700161b6d3d48c4f6b6cb8f6893a77d',1,'cv::cudev::min(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7e88fd0b276bc8f582117afba6f69b8',1,'cv::cudev::min(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ebc299c55f1c956ba1bf59818339a9',1,'cv::cudev::min(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490a5a4ee4b491ca52355d3591963d36',1,'cv::cudev::min(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3deb31d4bd9746fe908aae0a32876a67',1,'cv::cudev::min(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7443e024eba9d6e7dba462db0f87b09',1,'cv::cudev::min(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f584667f590a24d7952bba2c38b9d38',1,'cv::cudev::min(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fa8e7016286ff7a654d7f61c0b229ed',1,'cv::cudev::min(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbdb0b1d874b4d611fbe2fc87aa6723e',1,'cv::cudev::min(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25355dc07c2a9bcfe29dd47ffbd1af1f',1,'cv::cudev::min(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga968ddc4b3f1330fd8bba47996a879279',1,'cv::cudev::min(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00c88b38b31430626b18a806bab64102',1,'cv::cudev::min(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01ef9f5f0c55a33ed31f61b8996a9ef2',1,'cv::cudev::min(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b6e96bf59d8775fe468c8b0f0cd4c59',1,'cv::cudev::min(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053670b49cc762f89cd71a48a23410b2',1,'cv::cudev::min(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ae5c5fe2a9037803d26dc7ac9dc84e6',1,'cv::cudev::min(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebde1cc8ab3c8a2489f018498b4af0e1',1,'cv::cudev::min(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga328aabd669c55a39527628ca404d6d68',1,'cv::cudev::min(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695465274932c09378b6c197485b592e',1,'cv::cudev::min(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga428a2859cdb238bbbbf2fdb9215514bc',1,'cv::cudev::min(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8c71d074f87253f2743bf2d51342f58',1,'cv::cudev::min(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad695d4aa08dad8457dc787eb5b973397',1,'cv::cudev::min(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0500af3d7867bfd51c3cad36ba0a491e',1,'cv::cudev::min(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40714aaf703568f042ac2334279c96be',1,'cv::cudev::min(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79fc45bfa8191d6dacaf6d791c8d657d',1,'cv::cudev::min(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf2fc475cfe7c1829fa659aad92f5311',1,'cv::cudev::min(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3311a28f02b9f7f2322042ba73793dc',1,'cv::cudev::min(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga578896b54a57ff07a3bf7d0c3fd2543f',1,'cv::cudev::min(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc186a6d010c07d69d9f2659f91f172',1,'cv::cudev::min(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c0b1bc40a2ec46f6eb78af0a80253e',1,'cv::cudev::min(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a838e528321de5c93cd881016818f4',1,'cv::cudev::min(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae91887a3df27695bfac7c04a17e7f317',1,'cv::cudev::min(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d81f05a2715d7b4869c831e948241f',1,'cv::cudev::min(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ffc1aaa7e1fbf701e7c705005bbddb',1,'cv::cudev::min(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1dccc25340fb0aaebd5570168f9523f',1,'cv::cudev::min(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6db34e52d79cc78bb82d6473ed9d260b',1,'cv::cudev::min(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d9172e56b98d1e9db062064c8871c2a',1,'cv::cudev::min(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43a5a174cfe82f50b81cae0fef539eb2',1,'cv::cudev::min(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a35bdd7cf565b9ade2b66e59bd0ed',1,'cv::cudev::min(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f2de1cd74a26036c9655cac8f4fd12b',1,'cv::cudev::min(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bbfbc5daa53d92b244b57ea9c7001b3',1,'cv::cudev::min(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c0105c80bfe524779da1b354f6757e6',1,'cv::cudev::min(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga376a6835981117634436f321b2ce2a92',1,'cv::cudev::min(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abd5ca68674510c6de74842959cfdc7',1,'cv::cudev::min(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb06294a2cfbb6069b757839c7fd9da',1,'cv::cudev::min(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ff980b4d39740767b63f1de88d1b57',1,'cv::cudev::min(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7df99230006a5cc5615b0011df7a36',1,'cv::cudev::min(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab249d89f99bb58dd18ca378c735a020',1,'cv::cudev::min(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0253aab8205cbcdfe6214ac2a69fe581',1,'cv::cudev::min(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520bff992e84829c710b2e09546fa22',1,'cv::cudev::min(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f2589513e2749a9851c4124646619b9',1,'cv::cudev::min(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5cbd2b6ca7192b0bd8e8495ef5159b8',1,'cv::cudev::min(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0488483f92053697cbcd087185945cf1',1,'cv::cudev::min(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01bddf9f2a64d5b3e53439be20d9c409',1,'cv::cudev::min(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfea1d9d44ed701c8e800349e04f23ee',1,'cv::cudev::min(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad80ae937fbf7a3dc21a6a6fa8180b099',1,'cv::cudev::min(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72e8042831b9697209fae75abf289835',1,'cv::cudev::min(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff909acfd57096f7c944766d1f65439',1,'cv::cudev::min(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga994dcac74e8ff3a0f53eec9f742c97da',1,'cv::cudev::min(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bf016e8bdbabc4af9fa4e017c17507e',1,'cv::cudev::min(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0e38244f6b1acb8682e3f85143bd492',1,'cv::cudev::min(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabba296ea279127cee978c2e3fb735522',1,'cv::cudev::min(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44e25ba04453413a2aefc32c98efd3d9',1,'cv::cudev::min(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga269a8ed52e0311c9346d987a756dc884',1,'cv::cudev::min(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3fda8022014b87c0102d0bbe0731809',1,'cv::cudev::min(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf44d7528016be23f9f4ef3a7da28bdac',1,'cv::cudev::min(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bcbc2bc3b592e71257b4ee668778787',1,'cv::cudev::min(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b2d8959b9f43f2bc2806dc0ec78a100',1,'cv::cudev::min(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f0ef4c14e25abea43ff8946afeafc8',1,'cv::cudev::min(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca8f4d79b4cc1dec4c909ecf5ccca6a6',1,'cv::cudev::min(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae92efcdaa0c6fab988a414451359851a',1,'cv::cudev::min(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24f7488a901b2674720f7a5126131e64',1,'cv::cudev::min(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11a1d2f321a3eeef5dc50189f5b2ae9e',1,'cv::cudev::min(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39261d4880c70eb9e3ef72458b4ac242',1,'cv::cudev::min(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9eb9db0ca15633cccfddb52a962b6f6f',1,'cv::cudev::min(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e93316cdeb4b820699835dc2c2451cd',1,'cv::cudev::min(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4a86c57c6faaa3c448c0f865a29b26',1,'cv::cudev::min(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3948d81d0bef9933acb0e62becdaebb1',1,'cv::cudev::min(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0eb3c2749a2fc4328bdf119d66c6bc4',1,'cv::cudev::min(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08f676bba98d6a2b2ff33bbb36c458ff',1,'cv::cudev::min(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70b3c38288b779b54682e86ad916fdac',1,'cv::cudev::min(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga165246f51a13bed7eab30ef17dcbc866',1,'cv::cudev::min(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51aaec59cc082c1de9ff5943f582b8a7',1,'cv::cudev::min(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad94786f5db09d1f9ee11cd46a3072e9d',1,'cv::cudev::min(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fbef402308aa4d0431e52e9e59043fc',1,'cv::cudev::min(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bd9efd0d4387ea02188f653b32660ca',1,'cv::cudev::min(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa933f0fd3d30808cb1b00cd3a39143b1',1,'cv::cudev::min(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d51422ef09b9121b7869ad2e5e5343d',1,'cv::cudev::min(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb37e86108df64988afff37c569bf1a',1,'cv::cudev::min(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd636d4ca9bfb329325255cf9471c0b',1,'cv::cudev::min(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4985add7084003b38bae25ce9b5eae2',1,'cv::cudev::min(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc007a2636b9d49e09c17caccca7b41e',1,'cv::cudev::min(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef22b25899d27ffa8f09721d1f5d8b01',1,'cv::cudev::min(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a8db4271fd8c29e4a9c986c8ffa2eb',1,'cv::cudev::min(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0adb3df57e4ce8523b76eb59fe026c1',1,'cv::cudev::min(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99455f76095aede9458911725660297',1,'cv::cudev::min(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06193d22fbddc873a3062371b1854d71',1,'cv::cudev::min(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39835721b56a82de6caea12b5ee0015f',1,'cv::cudev::min(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a9e0cefdaf6cb3661a2319e677167d1',1,'cv::cudev::min(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9376163743f15adf0f696ad00a5e96a2',1,'cv::cudev::min(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga684f17ba826938b730c28b1cf7e16970',1,'cv::cudev::min(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga245743829629cc8a53765790b8ef1433',1,'cv::cudev::min(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae70127cdf2e353258baef57e46ab4189',1,'cv::cudev::min(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf82c6bf26acf9096cd6f8d832e205a9e',1,'cv::cudev::min(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f990e7805334d097290763648fe0d15',1,'cv::cudev::min(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc89effe4a6e1877b214a90c228295fb',1,'cv::cudev::min(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac39cc5c8089033352304fecdb0c23a4a',1,'cv::cudev::min(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga609464e0f3eadb85eb02553bc55c966b',1,'cv::cudev::min(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d1edf16d076507bdeac3810ac34fea1',1,'cv::cudev::min(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6ff0c0ed6a04957c5ebfedd44429fa',1,'cv::cudev::min(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf850e4d7c3c2c5e301a444d81f97b0e9',1,'cv::cudev::min(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28fb416063c7287d74bd18444dbad517',1,'cv::cudev::min(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafac21d2fddb5266c56b94f0cd5060957',1,'cv::cudev::min(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafc4c9e25951034a070b138191a1646a',1,'cv::cudev::min(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a023347bfd7b017630d6396006c919e',1,'cv::cudev::min(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab395407fb935812dd1b2ebbba595861a',1,'cv::cudev::min(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8a6eebe9af1fab17cf91f2aeb54085b',1,'cv::cudev::min(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e644816e75c72b1f5514aa1c9a559f2',1,'cv::cudev::min(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9233bc7f6b5a39cf9b548d268c878a5e',1,'cv::cudev::min(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6b7c35282b6fc4f731ca3c1a7675ed',1,'cv::cudev::min(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e3044507d9d9f6ea035c12e342bf4c4',1,'cv::cudev::min(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga712cbf6a3192826a28b292961344ec8b',1,'cv::cudev::min(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa757af15c28d5ece108f75b9d31303e2',1,'cv::cudev::min(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07de7b9863eb6866b8551688ab0cee91',1,'cv::cudev::min(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1abaccc6127e9ae108f715ea8ca240f',1,'cv::cudev::min(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b09d9c14fe356cdc8fa9e3a11ed35f9',1,'cv::cudev::min(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f99b55e3715d2f70934264240b9ea1a',1,'cv::cudev::min(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd5d53908ea8d992b7176d4f70bf2e1',1,'cv::cudev::min(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad65bb9c77829a24470594a1a06957a1d',1,'cv::cudev::min(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeadc2b477ffa2ba5629c1eeca0b49d63',1,'cv::cudev::min(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41cae75d54fbbd09e25adb26e58458f3',1,'cv::cudev::min(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e5555ef897df48dc04fed27b35a519d',1,'cv::cudev::min(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63987f0c60443f7907a223a23429fa16',1,'cv::cudev::min(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaded7b15e951de4fec9096063ca51bf1b',1,'cv::cudev::min(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae55f0ba96bec14b409e1908032060a01',1,'cv::cudev::min(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71aea75a5c530a382493ca538b9b3018',1,'cv::cudev::min(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451f65567b74e7f92a5d0c1be7090e20',1,'cv::cudev::min(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga003b58a72697803ec951afece96b067c',1,'cv::cudev::min(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga533e7120fae1d8ebc4f464b5ad076ff2',1,'cv::cudev::min(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f8f3331bd8cdfd7d2d0146115910a6c',1,'cv::cudev::min(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b6dea62568edd9aa7cfc0b7ee379b2e',1,'cv::cudev::min(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a607b7403c4299e0c743e50d2f70a0f',1,'cv::cudev::min(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac96713804ac8f9c0be35643a2d6b38a0',1,'cv::cudev::min(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga706808dc4050b903da640de8dc4ce19c',1,'cv::cudev::min(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6d1a1c63011d0b7f43a55e5c867065',1,'cv::cudev::min(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaafdf291e5b12dd034c25a0700e380df',1,'cv::cudev::min(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac052d68d62664c6a829fcfc234b5ad2a',1,'cv::cudev::min(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76f6319d3c3b6aea1d9cfa7e08ec645b',1,'cv::cudev::min(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41aac042716daa83b5cdafd2896cb20e',1,'cv::cudev::min(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga505a34b8ad2b832c446adc4693575ec1',1,'cv::cudev::min(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd2121e8d2a8eb3c442170ce48b30b1',1,'cv::cudev::min(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42f5af056b00eca967153edcf7588cd',1,'cv::cudev::min(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eca6d43aa7825a5757bf5f7effa2c17',1,'cv::cudev::min(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b0dc3a4d4aa6124c3e507986d97dfa',1,'cv::cudev::min(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f1b5f9d9048faafff9fb2d71b48bc66',1,'cv::cudev::min(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74639cd57a08c6e6f002d67251dd6e9',1,'cv::cudev::min(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547a488ab3fd582ac967006d5d41f84b',1,'cv::cudev::min(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae52d65012143641cf97b730ecaf8b384',1,'cv::cudev::min(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5a7dace4270dd3ffb889566f1d4ca7',1,'cv::cudev::min(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bc085902b3894d4369dc5e90e5a7047',1,'cv::cudev::min(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd9203fd6fc69c27d18f0a6dab04cdde',1,'cv::cudev::min(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c6bbe4f5e2d46c15d0276414176ce5a',1,'cv::cudev::min(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e73fe37dc5804eb6fa06a2cb784d929',1,'cv::cudev::min(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d0256b15a322a01a295af1227b210d0',1,'cv::cudev::min(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ec000596d80b26bd3b935fc9f510579',1,'cv::cudev::min(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9b38519d19d3122a8a167758e380ed',1,'cv::cudev::min(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gab714c7a4adc847d75bfc080ac92924f4',1,'cv::gapi::min()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9af368f182ee76d0463d0d8d5330b764',1,'min(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0b8852cd1a92366860e390e8abbe78dc',1,'min(const Mat &src1, const Mat &src2, Mat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa83bf3dce9a4a488675347fff6692cb9',1,'min(const UMat &src1, const UMat &src2, UMat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga2473116e9ce9a101a7e6ed53753df9b6',1,'min()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac48df53b8fd34b87e7b121fa8fd4c379',1,'min(const softfloat &a, const softfloat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf625702f70e571f33784b0652be9a7b7',1,'min(const softdouble &a, const softdouble &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gab714c7a4adc847d75bfc080ac92924f4',1,'min(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga74f0b05a65b3d949c237abb5e6c60867',1,'min(InputArray src1, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166301154ec0c6fb8859c8126e013fac',1,'min(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37cfadd8b02bc1989b2ff264d915a6b',1,'min(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e7580e80893052d84dfb5ec5ca5f766',1,'min(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99931470f4d68820bbc5459ed795da8d',1,'min(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f515695538396fb8648b71901d058d',1,'min(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad2901b8dd9a2efa1ea3a075ddf2d3f8',1,'min(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga580140f65047fb3188cd74f2d0f69a08',1,'min(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf199b5514de7c6a6af1b2c73c5725b7b',1,'min(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa618ba2f3832b30d643cce7efa62a04c',1,'min(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c687dbc301bada436f1b666ac1ad4de',1,'min(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad638c54878b6ccf16f85915845369fb8',1,'min(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77ec7dd3c8bf8d93adb1a0ae89226dc0',1,'min(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68ba59a2fd07a335aa566788ae5b6dd8',1,'min(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga570aa1a8375e90a96942ba5a9d73a8b9',1,'min(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c5a8171954561ee7d86bad9a5b69ca',1,'min(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d89f72aa99839fa446920cee353de8',1,'min(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad897218ccbbb0e9cc8660213479afad2',1,'min(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga211f9a750f17f04c671e1ecff782d3b0',1,'min(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga534ff33d0fb6a9f231c45e11ec109c06',1,'min(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76547c7e7ce1e38e4bfbc95c41f211a9',1,'min(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f48115719f2492736e6c1e6e54b47bc',1,'min(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea84f0591c4aa8110ee233fd83f3b2e7',1,'min(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29bc62147e04bbc4d5cc713722b3ebc7',1,'min(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a27832d49d358b841977db8ac614fe',1,'min(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga874939daee476a502f9e25a60d11a0af',1,'min(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17b5b845d773a38304e10c6f6ef7a63b',1,'min(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40ba01d1818bae80a0b25cced8a91b0e',1,'min(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ea00427d284684a5381f925c8865413',1,'min(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e3b6cc4c9f631582962e2e8a570974',1,'min(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cbeba62c9983bec445ede74fe15c5d',1,'min(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a26ede9e7b8aff8af95843ae065a3d6',1,'min(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3b5b82737560408526a05e60a01cf0c',1,'min(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50b5e9c2bd4b51a9ca871a2affbab6be',1,'min(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bc7c6f847a6b03438d75ad28b20e50',1,'min(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5700161b6d3d48c4f6b6cb8f6893a77d',1,'min(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7e88fd0b276bc8f582117afba6f69b8',1,'min(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ebc299c55f1c956ba1bf59818339a9',1,'min(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490a5a4ee4b491ca52355d3591963d36',1,'min(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3deb31d4bd9746fe908aae0a32876a67',1,'min(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7443e024eba9d6e7dba462db0f87b09',1,'min(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f584667f590a24d7952bba2c38b9d38',1,'min(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fa8e7016286ff7a654d7f61c0b229ed',1,'min(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbdb0b1d874b4d611fbe2fc87aa6723e',1,'min(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25355dc07c2a9bcfe29dd47ffbd1af1f',1,'min(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga968ddc4b3f1330fd8bba47996a879279',1,'min(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00c88b38b31430626b18a806bab64102',1,'min(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01ef9f5f0c55a33ed31f61b8996a9ef2',1,'min(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b6e96bf59d8775fe468c8b0f0cd4c59',1,'min(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053670b49cc762f89cd71a48a23410b2',1,'min(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ae5c5fe2a9037803d26dc7ac9dc84e6',1,'min(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebde1cc8ab3c8a2489f018498b4af0e1',1,'min(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga328aabd669c55a39527628ca404d6d68',1,'min(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695465274932c09378b6c197485b592e',1,'min(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga428a2859cdb238bbbbf2fdb9215514bc',1,'min(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8c71d074f87253f2743bf2d51342f58',1,'min(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad695d4aa08dad8457dc787eb5b973397',1,'min(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0500af3d7867bfd51c3cad36ba0a491e',1,'min(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40714aaf703568f042ac2334279c96be',1,'min(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79fc45bfa8191d6dacaf6d791c8d657d',1,'min(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf2fc475cfe7c1829fa659aad92f5311',1,'min(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3311a28f02b9f7f2322042ba73793dc',1,'min(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga578896b54a57ff07a3bf7d0c3fd2543f',1,'min(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc186a6d010c07d69d9f2659f91f172',1,'min(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c0b1bc40a2ec46f6eb78af0a80253e',1,'min(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a838e528321de5c93cd881016818f4',1,'min(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae91887a3df27695bfac7c04a17e7f317',1,'min(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d81f05a2715d7b4869c831e948241f',1,'min(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ffc1aaa7e1fbf701e7c705005bbddb',1,'min(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1dccc25340fb0aaebd5570168f9523f',1,'min(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6db34e52d79cc78bb82d6473ed9d260b',1,'min(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d9172e56b98d1e9db062064c8871c2a',1,'min(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43a5a174cfe82f50b81cae0fef539eb2',1,'min(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a35bdd7cf565b9ade2b66e59bd0ed',1,'min(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f2de1cd74a26036c9655cac8f4fd12b',1,'min(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bbfbc5daa53d92b244b57ea9c7001b3',1,'min(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c0105c80bfe524779da1b354f6757e6',1,'min(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga376a6835981117634436f321b2ce2a92',1,'min(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abd5ca68674510c6de74842959cfdc7',1,'min(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb06294a2cfbb6069b757839c7fd9da',1,'min(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ff980b4d39740767b63f1de88d1b57',1,'min(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7df99230006a5cc5615b0011df7a36',1,'min(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab249d89f99bb58dd18ca378c735a020',1,'min(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0253aab8205cbcdfe6214ac2a69fe581',1,'min(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520bff992e84829c710b2e09546fa22',1,'min(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f2589513e2749a9851c4124646619b9',1,'min(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5cbd2b6ca7192b0bd8e8495ef5159b8',1,'min(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0488483f92053697cbcd087185945cf1',1,'min(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01bddf9f2a64d5b3e53439be20d9c409',1,'min(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfea1d9d44ed701c8e800349e04f23ee',1,'min(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad80ae937fbf7a3dc21a6a6fa8180b099',1,'min(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72e8042831b9697209fae75abf289835',1,'min(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff909acfd57096f7c944766d1f65439',1,'min(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga994dcac74e8ff3a0f53eec9f742c97da',1,'min(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bf016e8bdbabc4af9fa4e017c17507e',1,'min(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0e38244f6b1acb8682e3f85143bd492',1,'min(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabba296ea279127cee978c2e3fb735522',1,'min(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44e25ba04453413a2aefc32c98efd3d9',1,'min(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga269a8ed52e0311c9346d987a756dc884',1,'min(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3fda8022014b87c0102d0bbe0731809',1,'min(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf44d7528016be23f9f4ef3a7da28bdac',1,'min(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bcbc2bc3b592e71257b4ee668778787',1,'min(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b2d8959b9f43f2bc2806dc0ec78a100',1,'min(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f0ef4c14e25abea43ff8946afeafc8',1,'min(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca8f4d79b4cc1dec4c909ecf5ccca6a6',1,'min(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae92efcdaa0c6fab988a414451359851a',1,'min(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24f7488a901b2674720f7a5126131e64',1,'min(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11a1d2f321a3eeef5dc50189f5b2ae9e',1,'min(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39261d4880c70eb9e3ef72458b4ac242',1,'min(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9eb9db0ca15633cccfddb52a962b6f6f',1,'min(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e93316cdeb4b820699835dc2c2451cd',1,'min(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4a86c57c6faaa3c448c0f865a29b26',1,'min(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3948d81d0bef9933acb0e62becdaebb1',1,'min(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0eb3c2749a2fc4328bdf119d66c6bc4',1,'min(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08f676bba98d6a2b2ff33bbb36c458ff',1,'min(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70b3c38288b779b54682e86ad916fdac',1,'min(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga165246f51a13bed7eab30ef17dcbc866',1,'min(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51aaec59cc082c1de9ff5943f582b8a7',1,'min(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad94786f5db09d1f9ee11cd46a3072e9d',1,'min(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fbef402308aa4d0431e52e9e59043fc',1,'min(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bd9efd0d4387ea02188f653b32660ca',1,'min(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa933f0fd3d30808cb1b00cd3a39143b1',1,'min(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d51422ef09b9121b7869ad2e5e5343d',1,'min(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb37e86108df64988afff37c569bf1a',1,'min(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd636d4ca9bfb329325255cf9471c0b',1,'min(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4985add7084003b38bae25ce9b5eae2',1,'min(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc007a2636b9d49e09c17caccca7b41e',1,'min(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef22b25899d27ffa8f09721d1f5d8b01',1,'min(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a8db4271fd8c29e4a9c986c8ffa2eb',1,'min(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0adb3df57e4ce8523b76eb59fe026c1',1,'min(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99455f76095aede9458911725660297',1,'min(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06193d22fbddc873a3062371b1854d71',1,'min(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39835721b56a82de6caea12b5ee0015f',1,'min(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a9e0cefdaf6cb3661a2319e677167d1',1,'min(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9376163743f15adf0f696ad00a5e96a2',1,'min(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga684f17ba826938b730c28b1cf7e16970',1,'min(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga245743829629cc8a53765790b8ef1433',1,'min(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae70127cdf2e353258baef57e46ab4189',1,'min(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf82c6bf26acf9096cd6f8d832e205a9e',1,'min(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f990e7805334d097290763648fe0d15',1,'min(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc89effe4a6e1877b214a90c228295fb',1,'min(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac39cc5c8089033352304fecdb0c23a4a',1,'min(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga609464e0f3eadb85eb02553bc55c966b',1,'min(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d1edf16d076507bdeac3810ac34fea1',1,'min(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6ff0c0ed6a04957c5ebfedd44429fa',1,'min(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf850e4d7c3c2c5e301a444d81f97b0e9',1,'min(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28fb416063c7287d74bd18444dbad517',1,'min(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafac21d2fddb5266c56b94f0cd5060957',1,'min(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafc4c9e25951034a070b138191a1646a',1,'min(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a023347bfd7b017630d6396006c919e',1,'min(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab395407fb935812dd1b2ebbba595861a',1,'min(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8a6eebe9af1fab17cf91f2aeb54085b',1,'min(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e644816e75c72b1f5514aa1c9a559f2',1,'min(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9233bc7f6b5a39cf9b548d268c878a5e',1,'min(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6b7c35282b6fc4f731ca3c1a7675ed',1,'min(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e3044507d9d9f6ea035c12e342bf4c4',1,'min(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga712cbf6a3192826a28b292961344ec8b',1,'min(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa757af15c28d5ece108f75b9d31303e2',1,'min(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07de7b9863eb6866b8551688ab0cee91',1,'min(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1abaccc6127e9ae108f715ea8ca240f',1,'min(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b09d9c14fe356cdc8fa9e3a11ed35f9',1,'min(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f99b55e3715d2f70934264240b9ea1a',1,'min(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd5d53908ea8d992b7176d4f70bf2e1',1,'min(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad65bb9c77829a24470594a1a06957a1d',1,'min(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeadc2b477ffa2ba5629c1eeca0b49d63',1,'min(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41cae75d54fbbd09e25adb26e58458f3',1,'min(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e5555ef897df48dc04fed27b35a519d',1,'min(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63987f0c60443f7907a223a23429fa16',1,'min(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaded7b15e951de4fec9096063ca51bf1b',1,'min(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae55f0ba96bec14b409e1908032060a01',1,'min(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71aea75a5c530a382493ca538b9b3018',1,'min(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451f65567b74e7f92a5d0c1be7090e20',1,'min(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga003b58a72697803ec951afece96b067c',1,'min(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga533e7120fae1d8ebc4f464b5ad076ff2',1,'min(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f8f3331bd8cdfd7d2d0146115910a6c',1,'min(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b6dea62568edd9aa7cfc0b7ee379b2e',1,'min(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a607b7403c4299e0c743e50d2f70a0f',1,'min(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac96713804ac8f9c0be35643a2d6b38a0',1,'min(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga706808dc4050b903da640de8dc4ce19c',1,'min(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6d1a1c63011d0b7f43a55e5c867065',1,'min(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaafdf291e5b12dd034c25a0700e380df',1,'min(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac052d68d62664c6a829fcfc234b5ad2a',1,'min(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76f6319d3c3b6aea1d9cfa7e08ec645b',1,'min(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41aac042716daa83b5cdafd2896cb20e',1,'min(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga505a34b8ad2b832c446adc4693575ec1',1,'min(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd2121e8d2a8eb3c442170ce48b30b1',1,'min(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42f5af056b00eca967153edcf7588cd',1,'min(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eca6d43aa7825a5757bf5f7effa2c17',1,'min(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b0dc3a4d4aa6124c3e507986d97dfa',1,'min(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f1b5f9d9048faafff9fb2d71b48bc66',1,'min(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74639cd57a08c6e6f002d67251dd6e9',1,'min(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547a488ab3fd582ac967006d5d41f84b',1,'min(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae52d65012143641cf97b730ecaf8b384',1,'min(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5a7dace4270dd3ffb889566f1d4ca7',1,'min(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bc085902b3894d4369dc5e90e5a7047',1,'min(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd9203fd6fc69c27d18f0a6dab04cdde',1,'min(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c6bbe4f5e2d46c15d0276414176ce5a',1,'min(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e73fe37dc5804eb6fa06a2cb784d929',1,'min(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d0256b15a322a01a295af1227b210d0',1,'min(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ec000596d80b26bd3b935fc9f510579',1,'min(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9b38519d19d3122a8a167758e380ed',1,'min(const double3 &a, double s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a694c714713cacc857e126157b5472448',1,'__gnu_parallel::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gad48656de2f272a953455e1fff2532125',1,'std::min(const _Tp &__a, const _Tp &__b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6499dc0f7db12560643a3b79db5357f6',1,'std::min(const _Tp &__a, const _Tp &__b, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41cf9f2fac24470499589628f657be67',1,'min() const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gad48656de2f272a953455e1fff2532125',1,'min(const _Tp &__a, const _Tp &__b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6499dc0f7db12560643a3b79db5357f6',1,'min(const _Tp &__a, const _Tp &__b, _Compare __comp)(Global Namespace)']]], + ['min16s_756',['min16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae83e8c8c49856c8ff27464a5db0d9675',1,'cv::hal::min16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae83e8c8c49856c8ff27464a5db0d9675',1,'min16s()(Global Namespace)']]], + ['min16u_757',['min16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga335e895c38ac1eb36c369be486da8153',1,'cv::hal::min16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga335e895c38ac1eb36c369be486da8153',1,'min16u()(Global Namespace)']]], + ['min32f_758',['min32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf5f3e8331a257006805cc99669177886',1,'cv::hal::min32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf5f3e8331a257006805cc99669177886',1,'min32f()(Global Namespace)']]], + ['min32s_759',['min32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5700a944987bea8f8b1d690bef9ddb86',1,'cv::hal::min32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5700a944987bea8f8b1d690bef9ddb86',1,'min32s()(Global Namespace)']]], + ['min64f_760',['min64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1dfb30bfd99e7ec82e403ac1d2ba564',1,'cv::hal::min64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1dfb30bfd99e7ec82e403ac1d2ba564',1,'min64f()(Global Namespace)']]], + ['min8s_761',['min8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga776e806b44d419b8fe1aeeb0edc33b19',1,'cv::hal::min8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga776e806b44d419b8fe1aeeb0edc33b19',1,'min8s()(Global Namespace)']]], + ['min8u_762',['min8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga728aef20afc83e88001bf555e5375820',1,'cv::hal::min8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga728aef20afc83e88001bf555e5375820',1,'min8u()(Global Namespace)']]], + ['min_5f_763',['min_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03ebd56c9351013f5bb957a585f7137',1,'cv::cudev::min_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03ebd56c9351013f5bb957a585f7137',1,'min_()(Global Namespace)']]], + ['min_5fapi_5fversion_764',['min_api_version',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#a9ff1dcbcd3b842ec86114f556a38ad8a',1,'OpenCV_API_Header']]], + ['min_5fdet_5fconf_765',['min_det_conf',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#aa0e43d74962bb777b1ab22be1e8e2616',1,'cv::tbm::TrackerParams']]], + ['min_5felement_766',['min_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga1de5df2bd9b3d6e5716e82c95ae6df2a',1,'std::min_element(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaef494344047573854d8e2d34070fd2b4',1,'std::min_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga1de5df2bd9b3d6e5716e82c95ae6df2a',1,'min_element(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaef494344047573854d8e2d34070fd2b4',1,'min_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], + ['min_5felement_5fminimal_5fn_767',['min_element_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#aa85f76a1f1bfd6c87efed32062222a05',1,'__gnu_parallel::_Settings']]], + ['min_5fexponent_768',['min_exponent',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a2552b13ee696d6a61a0a037fef1dc1e0',1,'std::__numeric_limits_base::min_exponent'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a2552b13ee696d6a61a0a037fef1dc1e0',1,'std::numeric_limits::min_exponent']]], + ['min_5fexponent10_769',['min_exponent10',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ad10027037371bb1138225df2876d5e6c',1,'std::__numeric_limits_base::min_exponent10'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ad10027037371bb1138225df2876d5e6c',1,'std::numeric_limits::min_exponent10']]], + ['min_5fprobability_5fancestor_770',['min_probability_ancestor',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#aaec3c9b6265724b67ebe16d24ddacd06',1,'cv::text::ERStat']]], + ['min_5ftrack_5fduration_771',['min_track_duration',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#ab694f386f8bbdd3a40e7b19b96bf45c2',1,'cv::tbm::TrackerParams']]], + ['minarea_772',['minArea',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#ace988d1613ed46c43458d04780634300',1,'cv::cuda::FGDParams::minArea'],['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a6a6c9c6120a771a5775578d7fdb72f17',1,'cv::SimpleBlobDetector::Params::minArea']]], + ['minarearect_773',['minAreaRect',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga3d476a3417130ae5154aea421ca7ead9',1,'cv::minAreaRect()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga3d476a3417130ae5154aea421ca7ead9',1,'minAreaRect()(Global Namespace)']]], + ['mincircularity_774',['minCircularity',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#aabf6e03342ba75e3cb7b1ba624f68793',1,'cv::SimpleBlobDetector::Params']]], + ['mincoeff_775',['minCoeff',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'Eigen::DenseBase::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'Eigen::DenseBase::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'Eigen::DenseBase::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'DenseBase< ArrayWrapper< ExpressionType > >::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'DenseBase< ArrayWrapper< ExpressionType > >::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'DenseBase< ArrayWrapper< ExpressionType > >::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'DenseBase< Solve< Decomposition, RhsType > >::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'DenseBase< Solve< Decomposition, RhsType > >::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'DenseBase< Solve< Decomposition, RhsType > >::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'Eigen::VectorwiseOp::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Derived, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Derived, Vertical >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::minCoeff()']]], + ['minconvexity_776',['minConvexity',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a9f8137228ba6eea83814d21ad2b3f97d',1,'cv::SimpleBlobDetector::Params']]], + ['mincornerdistancerate_777',['minCornerDistanceRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a7966579df6a68388a45973533b3cd054',1,'cv::aruco::DetectorParameters']]], + ['mindensity_778',['minDensity',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a5d3f633ba3a4734bb5285bd7470e0c25',1,'cv::CirclesGridFinderParameters']]], + ['mindepth_779',['minDepth',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a5a5770574b40555feff550b22efa705b',1,'cv::rgbd::ICPOdometry::minDepth'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a857d420228833e27aa87e156d5721789',1,'cv::rgbd::RgbdICPOdometry::minDepth'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#ac3250a3a00edafd9543946682b5309cd',1,'cv::rgbd::RgbdOdometry::minDepth']]], + ['mindetectionperiod_780',['minDetectionPeriod',['https://docs.opencv.org/4.2.0/d4/d80/structcv_1_1DetectionBasedTracker_1_1Parameters.html#a50a8e00de9157289123f09e7cd1d445f',1,'cv::DetectionBasedTracker::Parameters']]], + ['mindistancetoaddkeypoint_781',['minDistanceToAddKeypoint',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a89e644f5ed6c6a20ff6f920774d76baf',1,'cv::CirclesGridFinderParameters']]], + ['mindistancetoborder_782',['minDistanceToBorder',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a93e8229b7d7db81984eb32ef4c1d1f3f',1,'cv::aruco::DetectorParameters']]], + ['mindistbetweenblobs_783',['minDistBetweenBlobs',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#afd39dd0969c6549d00afb45beade6f0c',1,'cv::SimpleBlobDetector::Params']]], + ['mineigenvalue_784',['minEigenValue',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a1ad23a84fddee00611744b5e57a73cf0',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['minenclosingcircle_785',['minEnclosingCircle',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8ce13c24081bbc7151e9326f412190f1',1,'cv::minEnclosingCircle()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8ce13c24081bbc7151e9326f412190f1',1,'minEnclosingCircle()(Global Namespace)']]], + ['minenclosingtriangle_786',['minEnclosingTriangle',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga1513e72f6bbdfc370563664f71e0542f',1,'cv::minEnclosingTriangle()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga1513e72f6bbdfc370563664f71e0542f',1,'minEnclosingTriangle()(Global Namespace)']]], + ['mingradientmagnitudes_787',['minGradientMagnitudes',['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a236858a9cbaeffcc414b67746884b31d',1,'cv::rgbd::RgbdICPOdometry::minGradientMagnitudes'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a0ba69387535fcf5bb4fca8b6400c01b0',1,'cv::rgbd::RgbdOdometry::minGradientMagnitudes']]], + ['mingraphconfidence_788',['minGraphConfidence',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a566ef85146c08345fe399dfaa4e8a786',1,'cv::CirclesGridFinderParameters']]], + ['mini_5fbatch_789',['MINI_BATCH',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a11394898c4732995dd3af8a665f92894aabdf956ee52b567744e53767d0f41df1',1,'cv::ml::LogisticRegression']]], + ['miniflann_2ehpp_790',['miniflann.hpp',['https://docs.opencv.org/4.2.0/da/dfe/miniflann_8hpp.html',1,'']]], + ['minimize_791',['minimize',['https://docs.opencv.org/4.2.0/df/d11/classcv_1_1MinProblemSolver.html#ade85ab8dceca1ee4974f62b758fa90af',1,'cv::MinProblemSolver']]], + ['minimum_792',['minimum',['https://docs.opencv.org/4.2.0/d5/dc9/structcv_1_1cudev_1_1minimum.html',1,'cv::cudev']]], + ['minimum_20or_20maximum_793',['Element-wise minimum or maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'']]], + ['minimum_3c_20double_20_3e_794',['minimum< double >',['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1minimum_3_01double_01_4.html',1,'cv::cudev']]], + ['minimum_3c_20float_20_3e_795',['minimum< float >',['https://docs.opencv.org/4.2.0/d1/d9d/structcv_1_1cudev_1_1minimum_3_01float_01_4.html',1,'cv::cudev']]], + ['minimum_3c_20schar_20_3e_796',['minimum< schar >',['https://docs.opencv.org/4.2.0/d5/d75/structcv_1_1cudev_1_1minimum_3_01schar_01_4.html',1,'cv::cudev']]], + ['minimum_3c_20short_20_3e_797',['minimum< short >',['https://docs.opencv.org/4.2.0/db/d5b/structcv_1_1cudev_1_1minimum_3_01short_01_4.html',1,'cv::cudev']]], + ['minimum_3c_20uchar_20_3e_798',['minimum< uchar >',['https://docs.opencv.org/4.2.0/d8/d48/structcv_1_1cudev_1_1minimum_3_01uchar_01_4.html',1,'cv::cudev']]], + ['minimum_3c_20uint_20_3e_799',['minimum< uint >',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1cudev_1_1minimum_3_01uint_01_4.html',1,'cv::cudev']]], + ['minimum_3c_20ushort_20_3e_800',['minimum< ushort >',['https://docs.opencv.org/4.2.0/de/dfa/structcv_1_1cudev_1_1minimum_3_01ushort_01_4.html',1,'cv::cudev']]], + ['mininertiaratio_801',['minInertiaRatio',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a7494ba01e46a71f75325f3142ff5d307',1,'cv::SimpleBlobDetector::Params']]], + ['mininlierratio_802',['minInlierRatio',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#a7601c6c793bbb8337f0de8526339c8af',1,'cv::videostab::MotionEstimatorRansacL2']]], + ['minmarkerdistancerate_803',['minMarkerDistanceRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a28b4eb55fe68292541e4272edc4fde86',1,'cv::aruco::DetectorParameters']]], + ['minmarkerperimeterrate_804',['minMarkerPerimeterRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#ad0a7fadbc6f9453e4d3777355dcafd51',1,'cv::aruco::DetectorParameters']]], + ['minmax_805',['minMax',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga8d7de68c10717cf25e787e3c20d2dfee',1,'cv::cuda::minMax()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga8d7de68c10717cf25e787e3c20d2dfee',1,'minMax()(Global Namespace)']]], + ['minmax_806',['minmax',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga67c7bf4c4b3c5cbf251a3812e06e0308',1,'std::minmax(const _Tp &__a, const _Tp &__b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga74c98df71fd53702699434040aacb249',1,'std::minmax(const _Tp &__a, const _Tp &__b, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga67c7bf4c4b3c5cbf251a3812e06e0308',1,'minmax(const _Tp &__a, const _Tp &__b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga74c98df71fd53702699434040aacb249',1,'minmax(const _Tp &__a, const _Tp &__b, _Compare __comp)(Global Namespace)']]], + ['minmax_5felement_807',['minmax_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabaec6cf28af83896d2253693d08d4cfe',1,'std::minmax_element(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaa8e6bf20463e0f605a548e7d7efb099d',1,'std::minmax_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabaec6cf28af83896d2253693d08d4cfe',1,'minmax_element(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaa8e6bf20463e0f605a548e7d7efb099d',1,'minmax_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], + ['minmaxidx_808',['minMaxIdx',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7622c466c628a75d9ed008b42250a73f',1,'cv::minMaxIdx()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7622c466c628a75d9ed008b42250a73f',1,'minMaxIdx()(Global Namespace)']]], + ['minmaxloc_809',['minMaxLoc',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab473bf2eb6d14ff97e89b355dac20707',1,'cv::minMaxLoc(InputArray src, double *minVal, double *maxVal=0, Point *minLoc=0, Point *maxLoc=0, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8873b86a29c5af51cafdcee82f8150a7',1,'cv::minMaxLoc(const SparseMat &a, double *minVal, double *maxVal, int *minIdx=0, int *maxIdx=0)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga5cacbc2a2323c4eaa81e7390c5d9f530',1,'cv::cuda::minMaxLoc()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab473bf2eb6d14ff97e89b355dac20707',1,'minMaxLoc(InputArray src, double *minVal, double *maxVal=0, Point *minLoc=0, Point *maxLoc=0, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8873b86a29c5af51cafdcee82f8150a7',1,'minMaxLoc(const SparseMat &a, double *minVal, double *maxVal, int *minIdx=0, int *maxIdx=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga5cacbc2a2323c4eaa81e7390c5d9f530',1,'minMaxLoc(InputArray src, double *minVal, double *maxVal, Point *minLoc, Point *maxLoc, InputArray mask=noArray())(Global Namespace)']]], + ['minmaxval_5f_810',['minMaxVal_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf18a35345e39d8e38a32d6396e30a8e',1,'cv::cudev::minMaxVal_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf18a35345e39d8e38a32d6396e30a8e',1,'minMaxVal_()(Global Namespace)']]], + ['minneighbors_811',['minNeighbors',['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html#a18c96f625bbb7dacf4246f9c867eac0b',1,'cv::face::CParams']]], + ['minneighbours_812',['minNeighbours',['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#a8ef03c2f2a5d822ef686d119a2800212',1,'cv::DetectionBasedTracker::IDetector']]], + ['minnumberofsamples_813',['minNumberOfSamples',['https://docs.opencv.org/4.2.0/d1/dcc/structcv_1_1optflow_1_1GPCTrainingParams.html#a2168707bcbf42324cbbc108591e835a6',1,'cv::optflow::GPCTrainingParams']]], + ['minobjsize_814',['minObjSize',['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#af89dbb1102becacb1bfae95069ab1bfc',1,'cv::DetectionBasedTracker::IDetector']]], + ['minorversion_815',['minorVersion',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a2dfd3373e10731b54083ebd415009679',1,'cv::cuda::DeviceInfo']]], + ['minotsustddev_816',['minOtsuStdDev',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#aefb84a734bdcc918e54bb2ff4f17f2f4',1,'cv::aruco::DetectorParameters']]], + ['minproblemsolver_817',['MinProblemSolver',['https://docs.opencv.org/4.2.0/df/d11/classcv_1_1MinProblemSolver.html',1,'cv']]], + ['minrepeatability_818',['minRepeatability',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a5fdde080e684655ad634a3be4fb52888',1,'cv::SimpleBlobDetector::Params']]], + ['minres_819',['minRes',['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#ae2122575355f297a10d33a9048c743fb',1,'cv::face::StandardCollector']]], + ['minrngedgeswitchdist_820',['minRNGEdgeSwitchDist',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#adc90e952bce24f63383a8c3c94c4b753',1,'cv::CirclesGridFinderParameters']]], + ['minsize_821',['minSize',['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html#a2511bab04817f942b7c2789e5e86159b',1,'cv::face::CParams']]], + ['minstd_5frand_822',['minstd_rand',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga06944ee85abb11c4d8332728514da20a',1,'std::minstd_rand'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga06944ee85abb11c4d8332728514da20a',1,'minstd_rand(Global Namespace)']]], + ['minstd_5frand0_823',['minstd_rand0',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga70e14a580880f05e94a51c6e103e1cd1',1,'std::minstd_rand0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga70e14a580880f05e94a51c6e103e1cd1',1,'minstd_rand0(Global Namespace)']]], + ['minthreshold_824',['minThreshold',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a6e749132c0e8702f3a7289986572bfff',1,'cv::SimpleBlobDetector::Params']]], + ['minus_825',['MINUS',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#ac72268153bf12925f601c4defe7d5e50ae4c8b209454fa9578ddb3af45da854c2',1,'cv::xfeatures2d::PCTSignatures']]], + ['minus_826',['minus',['https://docs.opencv.org/4.2.0/da/df1/structcv_1_1cudev_1_1minus.html',1,'cv::cudev::minus< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07359.html',1,'std::minus< class >']]], + ['minus_3c_20void_20_3e_827',['minus< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07383.html',1,'std']]], + ['minusdelta_828',['minusDelta',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#ad8c1822684034533a52969c837e5f96c',1,'cv::LineIterator']]], + ['minusstep_829',['minusStep',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a293eafffedcac965ae5d7fb7fc8d8345',1,'cv::LineIterator']]], + ['minutes_830',['minutes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#ab797381ce4735af1cb63ecde984ba94c',1,'std::chrono']]], + ['minval_831',['minVal',['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a7ce2f9514d5e05b99c325627dbbcba09',1,'cv::ml::ParamGrid']]], + ['minval_5f_832',['minVal_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba7fa397fed60ac4af5595a4dce4d92a',1,'cv::cudev::minVal_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba7fa397fed60ac4af5595a4dce4d92a',1,'minVal_()(Global Namespace)']]], + ['minvalue_833',['minValue',['https://docs.opencv.org/4.2.0/dc/dcd/classcv_1_1dnn_1_1ReLU6Layer.html#aa200bc4e9f9a501a47e881276631707f',1,'cv::dnn::ReLU6Layer']]], + ['miscellaneous_20image_20transformations_834',['Miscellaneous Image Transformations',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html',1,'']]], + ['mishlayer_835',['MishLayer',['https://docs.opencv.org/4.2.0/d4/da1/classcv_1_1dnn_1_1MishLayer.html',1,'cv::dnn']]], + ['mismatch_836',['mismatch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga44ee120346d18fb398be3891eb4a8c0c',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad3cb7460f4803c1073882c89456bb75c',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga67d3e43b97d25f32dd1661a93aa85ff1',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga07f5690e64fb9ece316f84ec99c28e5d',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga44ee120346d18fb398be3891eb4a8c0c',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad3cb7460f4803c1073882c89456bb75c',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _BinaryPredicate __binary_pred)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga67d3e43b97d25f32dd1661a93aa85ff1',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga07f5690e64fb9ece316f84ec99c28e5d',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _BinaryPredicate __binary_pred)(Global Namespace)']]], + ['miss_837',['Hit-or-Miss',['https://docs.opencv.org/4.2.0/db/d06/tutorial_hitOrMiss.html',1,'']]], + ['missingvalue_838',['missingValue',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#a852e02da238303d33fd5923b75657584',1,'cv::ml::TrainData']]], + ['missioncontrolprotocol_839',['MissionControlProtocol',['../classnet_1_1mc_1_1MissionControlProtocol.html',1,'net::mc']]], + ['mixchannels_840',['mixChannels',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga51d768c270a1cdd3497255017c4504be',1,'cv::mixChannels(const Mat *src, size_t nsrcs, Mat *dst, size_t ndsts, const int *fromTo, size_t npairs)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga89dd05fd8fe54f5b7b5d89bca21153a1',1,'cv::mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const int *fromTo, size_t npairs)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga83b61f9875e6618ee08487b21ec71ab1',1,'cv::mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const std::vector< int > &fromTo)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga51d768c270a1cdd3497255017c4504be',1,'mixChannels(const Mat *src, size_t nsrcs, Mat *dst, size_t ndsts, const int *fromTo, size_t npairs)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga89dd05fd8fe54f5b7b5d89bca21153a1',1,'mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const int *fromTo, size_t npairs)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga83b61f9875e6618ee08487b21ec71ab1',1,'mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const std::vector< int > &fromTo)(Global Namespace)']]], + ['mixed_5fclone_841',['MIXED_CLONE',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca9aeff931a5d5d18b094397f0ca5bb85f',1,'cv::MIXED_CLONE'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca9aeff931a5d5d18b094397f0ca5bb85f',1,'MIXED_CLONE(Global Namespace)']]], + ['mjpeg_842',['MJPEG',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a9104e3711964b4e7723bab15987f41b9a90aee40e0bad141df3ded65876999d74',1,'cv']]], + ['mkl_20from_20eigen_843',['Using Intel® MKL from Eigen',['https://eigen.tuxfamily.org/dox/TopicUsingIntelMKL.html',1,'']]], + ['mkview_844',['mkView',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a6f0fc00343ffd3e22573d85864785f39',1,'cv::gapi::fluid::Buffer']]], + ['ml_20module_845',['Machine Learning (ml module)',['https://docs.opencv.org/4.2.0/d1/d69/tutorial_table_of_content_ml.html',1,'']]], + ['ml_2ehpp_846',['ml.hpp',['https://docs.opencv.org/4.2.0/df/d5c/ml_2ml_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d29/ml_8hpp.html',1,'(Global Namespace)']]], + ['ml_5fintro_2emarkdown_847',['ml_intro.markdown',['https://docs.opencv.org/4.2.0/db/df6/ml__intro_8markdown.html',1,'']]], + ['mlab_848',['mlab',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1aa89085077df1acc691a2f02f39cefd',1,'cv::viz::Color']]], + ['mm_5faffine_849',['MM_AFFINE',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a30b3b23d3cdd42fd8a7c4e286472de36',1,'cv::videostab::MM_AFFINE'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a30b3b23d3cdd42fd8a7c4e286472de36',1,'MM_AFFINE(Global Namespace)']]], + ['mm_5fhomography_850',['MM_HOMOGRAPHY',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a3071d1039ef9d542486f51a864134fb2',1,'cv::videostab::MM_HOMOGRAPHY'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a3071d1039ef9d542486f51a864134fb2',1,'MM_HOMOGRAPHY(Global Namespace)']]], + ['mm_5frigid_851',['MM_RIGID',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a633545fdfe3273bb79ce349f79a1383c',1,'cv::videostab::MM_RIGID'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a633545fdfe3273bb79ce349f79a1383c',1,'MM_RIGID(Global Namespace)']]], + ['mm_5frotation_852',['MM_ROTATION',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a2765d1659d5a36bdd1c356396a624ae1',1,'cv::videostab::MM_ROTATION'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a2765d1659d5a36bdd1c356396a624ae1',1,'MM_ROTATION(Global Namespace)']]], + ['mm_5fsimilarity_853',['MM_SIMILARITY',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a1aca015a89be32663e700279ed2380f5',1,'cv::videostab::MM_SIMILARITY'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a1aca015a89be32663e700279ed2380f5',1,'MM_SIMILARITY(Global Namespace)']]], + ['mm_5ftranslation_854',['MM_TRANSLATION',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1ad150f24197611b08a99e45c5a93ef264',1,'cv::videostab::MM_TRANSLATION'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1ad150f24197611b08a99e45c5a93ef264',1,'MM_TRANSLATION(Global Namespace)']]], + ['mm_5ftranslation_5fand_5fscale_855',['MM_TRANSLATION_AND_SCALE',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a3d76e30fb2c762645cbd8c83b2d4d556',1,'cv::videostab::MM_TRANSLATION_AND_SCALE'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a3d76e30fb2c762645cbd8c83b2d4d556',1,'MM_TRANSLATION_AND_SCALE(Global Namespace)']]], + ['mm_5funknown_856',['MM_UNKNOWN',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a3354f345c38aa36dbf97cc17639bf9c2',1,'cv::videostab::MM_UNKNOWN'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ggac61e59db30b7d13983885d3ad3116ce1a3354f345c38aa36dbf97cc17639bf9c2',1,'MM_UNKNOWN(Global Namespace)']]], + ['mod_5fbased_5frange_5fhashing_857',['mod_based_range_hashing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11739.html',1,'__gnu_pbds::detail']]], + ['mod_5fbased_5frange_5fhashing_2ehpp_858',['mod_based_range_hashing.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01322.html',1,'']]], + ['modalities_859',['modalities',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a4e4080b2f211294fc79c55aa11654c2c',1,'cv::linemod::Detector']]], + ['modality_860',['Modality',['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html',1,'cv::linemod']]], + ['mode_861',['MODE',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#a2a97c5b832651524b8e782496b933d45',1,'cv::TrackerKCF']]], + ['mode_862',['Mode',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482d',1,'cv::FileStorage::Mode'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a114713924ec05a0309f4df7e918c0324',1,'cv::Stitcher::Mode']]], + ['mode_863',['mode',['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#af346c7c2d406ca2e05dcea11dcf39f24',1,'cv::text::OCRBeamSearchDecoder::mode'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a5776dd855966c99a8c15a7ab04bbcd81',1,'cv::text::OCRHMMDecoder::mode']]], + ['mode_5fclassify_864',['MODE_CLASSIFY',['https://docs.opencv.org/4.2.0/da/d3e/classcv_1_1TrackerSamplerCS.html#aa2224018a9802276b72810519752d770af87b7e1485da44104523f6063cef6e73',1,'cv::TrackerSamplerCS']]], + ['mode_5fdetect_865',['MODE_DETECT',['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#a2834448d2e780fea900ec7fefae1a138ab73351032c3072cf2acede25f4c68125',1,'cv::TrackerSamplerCSC']]], + ['mode_5fhh_866',['MODE_HH',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a2b29581546f96316b38d85b6d444addea63b8637d8c69a830927c267b3b4ce5a7',1,'cv::stereo::StereoBinarySGBM::MODE_HH'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ada549f34c6f030a64d3a1d2f364b547ba0f746667febe92e1189e924c40752660',1,'cv::StereoSGBM::MODE_HH']]], + ['mode_5fhh4_867',['MODE_HH4',['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ada549f34c6f030a64d3a1d2f364b547ba2bb93a960b8709039f81d7027b928559',1,'cv::StereoSGBM']]], + ['mode_5finit_5fneg_868',['MODE_INIT_NEG',['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#a2834448d2e780fea900ec7fefae1a138a699e67504963c1ef7adf3978098232dd',1,'cv::TrackerSamplerCSC']]], + ['mode_5finit_5fpos_869',['MODE_INIT_POS',['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#a2834448d2e780fea900ec7fefae1a138a256c577d2c2e5c157d3e6c90424498e8',1,'cv::TrackerSamplerCSC']]], + ['mode_5fnegative_870',['MODE_NEGATIVE',['https://docs.opencv.org/4.2.0/da/d3e/classcv_1_1TrackerSamplerCS.html#aa2224018a9802276b72810519752d770adbffdf4fa17dc363046362e2395ada38',1,'cv::TrackerSamplerCS']]], + ['mode_5fpositive_871',['MODE_POSITIVE',['https://docs.opencv.org/4.2.0/da/d3e/classcv_1_1TrackerSamplerCS.html#aa2224018a9802276b72810519752d770a6d9df662f3d423c95760db63f6b34479',1,'cv::TrackerSamplerCS']]], + ['mode_5fsgbm_872',['MODE_SGBM',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a2b29581546f96316b38d85b6d444addeac1cec4aa27cb3cdeae78a41e2f9151f7',1,'cv::stereo::StereoBinarySGBM::MODE_SGBM'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ada549f34c6f030a64d3a1d2f364b547ba21fac9fae6db6a60a940fd24cc61f081',1,'cv::StereoSGBM::MODE_SGBM']]], + ['mode_5fsgbm_5f3way_873',['MODE_SGBM_3WAY',['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ada549f34c6f030a64d3a1d2f364b547baa3ffd07d169f0d913c2402bf20595a9f',1,'cv::StereoSGBM']]], + ['mode_5ftrack_5fneg_874',['MODE_TRACK_NEG',['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#a2834448d2e780fea900ec7fefae1a138a80763dad360e213fdfa9352f663a0fa3',1,'cv::TrackerSamplerCSC']]], + ['mode_5ftrack_5fpos_875',['MODE_TRACK_POS',['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#a2834448d2e780fea900ec7fefae1a138a72fb1cdd9db81a1ba427357e0c3f4b2a',1,'cv::TrackerSamplerCSC']]], + ['model_876',['Model',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html',1,'cv::dnn::Model'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html',1,'cv::face::FacemarkAAM::Model'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a5ccfd862a641a6b48472a88d821f33bf',1,'cv::dnn::Model::Model()'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a7ad13e315a170b9c5e3ca212a1a0a909',1,'cv::dnn::Model::Model(const String &model, const String &config="")'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#aeda26984960f2985f0071e33a51b34d3',1,'cv::dnn::Model::Model(const Net &network)']]], + ['model_877',['model',['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html',1,'Fisheye camera model'],['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a267ed2dd0c97c9801fcddafa031600a5',1,'cv::Tracker::model'],['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a39135d03f0aca8fb099d0960a277e7b6',1,'cv::tracking::UnscentedKalmanFilterParams::model']]], + ['model_20analysis_878',['Training Model Analysis',['https://docs.opencv.org/4.2.0/d8/d09/tutorial_model_analysis.html',1,'']]], + ['model_5fanalysis_2emarkdown_879',['model_analysis.markdown',['https://docs.opencv.org/4.2.0/d7/d68/model__analysis_8markdown.html',1,'']]], + ['model_5ffilename_880',['model_filename',['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#ac9ddca5f45143782579a703e7e6e2b1e',1,'cv::face::FacemarkAAM::Params::model_filename'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a67fd2298bb7efdd49831707e24108491',1,'cv::face::FacemarkLBF::Params::model_filename']]], + ['model_5fpath_881',['model_path',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#ac819ca1d4c72c0ff505565b7c12b137f',1,'cv::gapi::ie::detail::ParamDesc']]], + ['model_5fscale_5fidx_882',['model_scale_idx',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html#aada12fc918928a31d73519ad8b3d0976',1,'cv::face::FacemarkAAM::Config']]], + ['modelestimation_883',['modelEstimation',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a84d712f280d1c4d0a8311f8f53089a2e',1,'cv::TrackerModel']]], + ['modelestimationimpl_884',['modelEstimationImpl',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#ad528142f5c5a1d2a7e122f54384a63ae',1,'cv::TrackerModel']]], + ['modelindex_885',['modelIndex',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a095abb29ff9c0a535f310468a541ada9',1,'cv::ppf_match_3d::Pose3D']]], + ['models_886',['Deformable Part-based Models',['https://docs.opencv.org/4.2.0/d9/d12/group__dpm.html',1,'']]], + ['models_887',['Load Caffe framework models',['https://docs.opencv.org/4.2.0/d5/de7/tutorial_dnn_googlenet.html',1,'']]], + ['models_20and_20derivated_20tools_888',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], + ['modelupdate_889',['modelUpdate',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a5049f30348c44b6aebb3651f3767dab0',1,'cv::TrackerModel']]], + ['modelupdateimpl_890',['modelUpdateImpl',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a6e17cc80adc68abf0c172be19b4bdc8a',1,'cv::TrackerModel']]], + ['modifiedcensustransform_891',['modifiedCensusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a27aeb319591612c6833327da2708277c',1,'cv::stereo::modifiedCensusTransform(const cv::Mat &img1, const cv::Mat &img2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2, const int type, int t=0, const cv::Mat &IntegralImage1=cv::Mat::zeros(100, 100, CV_8UC1), const cv::Mat &IntegralImage2=cv::Mat::zeros(100, 100, CV_8UC1))'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#af330a2a2f52998367d0c845f62d022a6',1,'cv::stereo::modifiedCensusTransform(const cv::Mat &img1, int kernelSize, cv::Mat &dist, const int type, int t=0, const cv::Mat &IntegralImage=cv::Mat::zeros(100, 100, CV_8UC1))']]], + ['modifiedcscensus_892',['ModifiedCsCensus',['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html',1,'cv::stereo::ModifiedCsCensus< num_images >'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#a2d69cd7875e886e398ebabe4dab2b7e3',1,'cv::stereo::ModifiedCsCensus::ModifiedCsCensus()'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#aedb39a47b4821dd3deb2cc334daeabcd',1,'cv::stereo::ModifiedCsCensus::ModifiedCsCensus(uint8_t **images, int ker)']]], + ['modifiers_893',['modifiers',['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#a81e30567f8f4099804cb2980ed4026df',1,'cv::viz::KeyboardEvent::modifiers'],['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a0a3d0f441e1efe3f3f8b201174dd434f',1,'cv::viz::MouseEvent::modifiers']]], + ['modify_20and_20save_20an_20image_894',['Load, Modify, and Save an Image',['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'']]], + ['modify_5fa_895',['MODIFY_A',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a4700f5207e66cdd9924bf64e34911832afb6aab7965c8f601696b10fa109e2789',1,'cv::SVD']]], + ['module_896',['module',['https://docs.opencv.org/4.2.0/d9/d97/tutorial_table_of_content_features2d.html',1,'2D Features framework (feature2d module)'],['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'ArUco marker detection (aruco module)'],['https://docs.opencv.org/4.2.0/d6/d55/tutorial_table_of_content_calib3d.html',1,'Camera calibration and 3D reconstruction (calib3d module)'],['https://eigen.tuxfamily.org/dox/group__Cholesky__Module.html',1,'Cholesky module'],['https://eigen.tuxfamily.org/dox/group__CholmodSupport__Module.html',1,'CholmodSupport module'],['https://docs.opencv.org/4.2.0/da/de7/tutorial_table_of_content_photo.html',1,'Computational photography (photo module)'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html',1,'Core module'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html',1,'Deep Neural Network module'],['https://docs.opencv.org/4.2.0/d2/d58/tutorial_table_of_content_dnn.html',1,'Deep Neural Networks (dnn module)'],['https://eigen.tuxfamily.org/dox/group__Eigenvalues__Module.html',1,'Eigenvalues module'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html',1,'Geometry module'],['https://docs.opencv.org/4.2.0/da/d2c/tutorial_table_of_content_gpu.html',1,'GPU-Accelerated Computer Vision (cuda module)'],['https://docs.opencv.org/4.2.0/df/d7e/tutorial_table_of_content_gapi.html',1,'Graph API (gapi module)'],['https://docs.opencv.org/4.2.0/d0/de2/tutorial_table_of_content_highgui.html',1,'High Level GUI and Media (highgui module)'],['https://eigen.tuxfamily.org/dox/group__Householder__Module.html',1,'Householder module'],['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'Image Input and Output (imgcodecs module)'],['https://docs.opencv.org/4.2.0/d7/da8/tutorial_table_of_content_imgproc.html',1,'Image Processing (imgproc module)'],['https://docs.opencv.org/4.2.0/d0/d33/tutorial_table_of_content_stitching.html',1,'Images stitching (stitching module)'],['https://eigen.tuxfamily.org/dox/group__IterativeLinearSolvers__Module.html',1,'IterativeLinearSolvers module'],['https://eigen.tuxfamily.org/dox/group__Jacobi__Module.html',1,'Jacobi module'],['https://eigen.tuxfamily.org/dox/group__KLUSupport__Module.html',1,'KLUSupport module'],['https://eigen.tuxfamily.org/dox/group__LU__Module.html',1,'LU module'],['https://docs.opencv.org/4.2.0/d1/d69/tutorial_table_of_content_ml.html',1,'Machine Learning (ml module)'],['https://eigen.tuxfamily.org/dox/group__MetisSupport__Module.html',1,'MetisSupport module'],['https://docs.opencv.org/4.2.0/d2/d64/tutorial_table_of_content_objdetect.html',1,'Object Detection (objdetect module)'],['https://eigen.tuxfamily.org/dox/group__OrderingMethods__Module.html',1,'OrderingMethods module'],['https://eigen.tuxfamily.org/dox/group__PardisoSupport__Module.html',1,'PardisoSupport module'],['https://eigen.tuxfamily.org/dox/group__PaStiXSupport__Module.html',1,'PaStiXSupport module'],['https://eigen.tuxfamily.org/dox/group__QR__Module.html',1,'QR module'],['https://docs.opencv.org/4.2.0/d9/d58/tutorial_table_of_content_quasi_dense_stereo.html',1,'Quasi Dense Stereo (stereo module)'],['https://eigen.tuxfamily.org/dox/group__Sparse__Module.html',1,'Sparse meta-module'],['https://eigen.tuxfamily.org/dox/group__SparseCholesky__Module.html',1,'SparseCholesky module'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html',1,'SparseCore module'],['https://eigen.tuxfamily.org/dox/group__SparseLU__Module.html',1,'SparseLU module'],['https://eigen.tuxfamily.org/dox/group__SparseQR__Module.html',1,'SparseQR module'],['https://eigen.tuxfamily.org/dox/group__SPQRSupport__Module.html',1,'SuiteSparseQR module'],['https://eigen.tuxfamily.org/dox/group__SuperLUSupport__Module.html',1,'SuperLUSupport module'],['https://eigen.tuxfamily.org/dox/group__SVD__Module.html',1,'SVD module'],['https://docs.opencv.org/4.2.0/d0/dda/tutorial_table_of_content_text.html',1,'Text module'],['https://docs.opencv.org/4.2.0/de/d7a/tutorial_table_of_content_core.html',1,'The Core Functionality (core module)'],['https://docs.opencv.org/4.2.0/d3/d89/tutorial_table_of_content_bgsegm.html',1,'Tutorials for bgsegm module'],['https://docs.opencv.org/4.2.0/de/d27/tutorial_table_of_content_face.html',1,'Tutorials for face module'],['https://eigen.tuxfamily.org/dox/group__UmfPackSupport__Module.html',1,'UmfPackSupport module'],['https://docs.opencv.org/4.2.0/da/dd0/tutorial_table_of_content_video.html',1,'Video analysis (video module)'],['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'Video Input and Output (videoio module)']]], + ['module_20brings_20implementations_20of_20different_20image_20hashing_20algorithms_897',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], + ['module_20changelog_898',['Face module changelog',['https://docs.opencv.org/4.2.0/d9/d47/face_changelog.html',1,'']]], + ['module_20faq_899',['Aruco module FAQ',['https://docs.opencv.org/4.2.0/d1/dcb/tutorial_aruco_faq.html',1,'']]], + ['module_20installation_900',['SFM module installation',['https://docs.opencv.org/4.2.0/db/db8/tutorial_sfm_installation.html',1,'']]], + ['module_20introduction_901',['CUDA Module Introduction',['https://docs.opencv.org/4.2.0/d2/dbc/cuda_intro.html',1,'']]], + ['module_20retina_20introduction_902',['Bioinspired Module Retina Introduction',['https://docs.opencv.org/4.2.0/d2/d94/bioinspired_retina.html',1,'']]], + ['modules_903',['modules',['https://eigen.tuxfamily.org/dox/group__Support__modules.html',1,'Support modules'],['https://docs.opencv.org/4.2.0/d3/d81/tutorial_contrib_root.html',1,'Tutorials for contrib modules']]], + ['modulus_904',['modulus',['https://docs.opencv.org/4.2.0/d7/d7f/structcv_1_1cudev_1_1modulus.html',1,'cv::cudev::modulus< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07371.html',1,'std::modulus< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a9c73f24c92d06c4aa7c5b2c37d8c6dcb',1,'std::linear_congruential_engine::modulus']]], + ['modulus_3c_20void_20_3e_905',['modulus< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07395.html',1,'std']]], + ['moments_906',['Moments',['https://docs.opencv.org/4.2.0/d0/d49/tutorial_moments.html',1,'Image Moments'],['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html',1,'cv::Moments'],['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a0382b98fdb23acdcb05c91a2a44e5a1f',1,'cv::Moments::Moments()'],['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ab8972f76cccd51af351cbda199fb4a0d',1,'cv::Moments::Moments(double m00, double m10, double m01, double m20, double m11, double m02, double m30, double m21, double m12, double m03)']]], + ['moments_907',['moments',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga556a180f43cab22649c23ada36a8a139',1,'cv::moments()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga556a180f43cab22649c23ada36a8a139',1,'moments(InputArray array, bool binaryImage=false)(Global Namespace)']]], + ['moments_2emarkdown_908',['moments.markdown',['https://docs.opencv.org/4.2.0/d9/d20/moments_8markdown.html',1,'']]], + ['monetary_909',['monetary',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a344e6500c766e554a71933878f1fc654',1,'std::locale']]], + ['money_5fbase_910',['money_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06003.html',1,'std']]], + ['money_5fget_911',['money_get',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html',1,'std::money_get< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a56b27ade4915b3ac1ae0e358f5f6266e',1,'std::money_get::money_get()']]], + ['money_5fput_912',['money_put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html',1,'std::money_put< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a69471496da9b95b41529a08b14c063f5',1,'std::money_put::money_put()']]], + ['moneypunct_913',['moneypunct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html',1,'std::moneypunct< _CharT, _Intl >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a82d4bbb3eaae4c5cf74e3652be13e67e',1,'std::moneypunct::moneypunct(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#aaabd1d7f1c7014add2c854305c76e73a',1,'std::moneypunct::moneypunct(__cache_type *__cache, size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a26aa970ef261e45586f3b161d2ec28e7',1,'std::moneypunct::moneypunct(__c_locale __cloc, const char *__s, size_t __refs=0)']]], + ['moneypunct_5fbyname_914',['moneypunct_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06019.html',1,'std']]], + ['monochrome_915',['Monochrome',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga1887af7daca9ccca0f51f90bc8777280a854c4e9c8ccb88e9bad306cdc21d38ee',1,'cv::cudacodec::Monochrome'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga1887af7daca9ccca0f51f90bc8777280a854c4e9c8ccb88e9bad306cdc21d38ee',1,'Monochrome(Global Namespace)']]], + ['monochrome_5ftransfer_916',['MONOCHROME_TRANSFER',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca8a64bb74d3ef61a73cf755f3a881fe70',1,'cv::MONOCHROME_TRANSFER'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca8a64bb74d3ef61a73cf755f3a881fe70',1,'MONOCHROME_TRANSFER(Global Namespace)']]], + ['monostate_917',['monostate',['https://docs.opencv.org/4.2.0/d5/da7/structcv_1_1util_1_1monostate.html',1,'cv::util']]], + ['more_20functions_918',['More Functions',['https://docs.opencv.org/4.2.0/d5/d45/tutorial_py_contours_more_functions.html',1,'Contours : More Functions'],['https://docs.opencv.org/4.2.0/d8/d1c/tutorial_js_contours_more_functions.html',1,'Contours : More Functions']]], + ['more_20morphology_20transformations_919',['More Morphology Transformations',['https://docs.opencv.org/4.2.0/d3/dbe/tutorial_opening_closing_hats.html',1,'']]], + ['moreaccuratemotionwobblesuppressor_920',['MoreAccurateMotionWobbleSuppressor',['https://docs.opencv.org/4.2.0/d8/da1/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressor.html',1,'cv::videostab']]], + ['moreaccuratemotionwobblesuppressorbase_921',['MoreAccurateMotionWobbleSuppressorBase',['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html',1,'cv::videostab::MoreAccurateMotionWobbleSuppressorBase'],['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html#a5c92896a72d9f706bca04fae077f614f',1,'cv::videostab::MoreAccurateMotionWobbleSuppressorBase::MoreAccurateMotionWobbleSuppressorBase()']]], + ['morph_922',['morph',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga24d63a25f503c51da1d80c5d86cc27bd',1,'cv::hal::morph()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga24d63a25f503c51da1d80c5d86cc27bd',1,'morph()(Global Namespace)']]], + ['morph_5fblackhat_923',['MORPH_BLACKHAT',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a24d27f56df6b98b1cb92ae8108d4638f',1,'cv::MORPH_BLACKHAT'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a24d27f56df6b98b1cb92ae8108d4638f',1,'MORPH_BLACKHAT(Global Namespace)']]], + ['morph_5fclose_924',['MORPH_CLOSE',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a68c4b9c6144a30bcd52d1cdf39bb30e1',1,'cv::MORPH_CLOSE'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a68c4b9c6144a30bcd52d1cdf39bb30e1',1,'MORPH_CLOSE(Global Namespace)']]], + ['morph_5fcross_925',['MORPH_CROSS',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggac2db39b56866583a95a5680313c314ada318435753d0b9f7faa241a658ec2e191',1,'cv::MORPH_CROSS'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggac2db39b56866583a95a5680313c314ada318435753d0b9f7faa241a658ec2e191',1,'MORPH_CROSS(Global Namespace)']]], + ['morph_5fdilate_926',['MORPH_DILATE',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a2b9f6b6fb168b4d1d5277caebfe7b73d',1,'cv::MORPH_DILATE'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a2b9f6b6fb168b4d1d5277caebfe7b73d',1,'MORPH_DILATE(Global Namespace)']]], + ['morph_5fellipse_927',['MORPH_ELLIPSE',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggac2db39b56866583a95a5680313c314ada33a3c67a61f349d21c507d05c53a755f',1,'cv::MORPH_ELLIPSE'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggac2db39b56866583a95a5680313c314ada33a3c67a61f349d21c507d05c53a755f',1,'MORPH_ELLIPSE(Global Namespace)']]], + ['morph_5ferode_928',['MORPH_ERODE',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32aa3783a21b429f4c31c178264a0403fcd',1,'cv::MORPH_ERODE'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32aa3783a21b429f4c31c178264a0403fcd',1,'MORPH_ERODE(Global Namespace)']]], + ['morph_5fgradient_929',['MORPH_GRADIENT',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a887efd64e82cee95a62f851c7f3b617b',1,'cv::MORPH_GRADIENT'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a887efd64e82cee95a62f851c7f3b617b',1,'MORPH_GRADIENT(Global Namespace)']]], + ['morph_5fhitmiss_930',['MORPH_HITMISS',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32acf55ff766595ec0174ba42852f0ac264',1,'cv::MORPH_HITMISS'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32acf55ff766595ec0174ba42852f0ac264',1,'MORPH_HITMISS(Global Namespace)']]], + ['morph_5flines_5fdetection_2emd_931',['morph_lines_detection.md',['https://docs.opencv.org/4.2.0/db/d18/morph__lines__detection_8md.html',1,'']]], + ['morph_5fopen_932',['MORPH_OPEN',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a08d3cc3a2ace00cec488966d31fa29ea',1,'cv::MORPH_OPEN'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32a08d3cc3a2ace00cec488966d31fa29ea',1,'MORPH_OPEN(Global Namespace)']]], + ['morph_5frect_933',['MORPH_RECT',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggac2db39b56866583a95a5680313c314ada260c4cbde19a749726763c01a074c60f',1,'cv::MORPH_RECT'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggac2db39b56866583a95a5680313c314ada260c4cbde19a749726763c01a074c60f',1,'MORPH_RECT(Global Namespace)']]], + ['morph_5ftophat_934',['MORPH_TOPHAT',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32ada67be24f4dce6d7e6c57527f8724f3b',1,'cv::MORPH_TOPHAT'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gga7be549266bad7b2e6a04db49827f9f32ada67be24f4dce6d7e6c57527f8724f3b',1,'MORPH_TOPHAT(Global Namespace)']]], + ['morphological_20operations_935',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], + ['morphological_20transformations_936',['Morphological Transformations',['https://docs.opencv.org/4.2.0/d9/d61/tutorial_py_morphological_ops.html',1,'Morphological Transformations'],['https://docs.opencv.org/4.2.0/d4/d76/tutorial_js_morphological_ops.html',1,'Morphological Transformations']]], + ['morphology_20on_20run_20length_20encoded_20image_937',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], + ['morphology_20transformations_938',['More Morphology Transformations',['https://docs.opencv.org/4.2.0/d3/dbe/tutorial_opening_closing_hats.html',1,'']]], + ['morphologydefaultbordervalue_939',['morphologyDefaultBorderValue',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga94756fad83d9d24d29c9bf478558c40a',1,'cv::morphologyDefaultBorderValue()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga94756fad83d9d24d29c9bf478558c40a',1,'morphologyDefaultBorderValue()(Global Namespace)']]], + ['morphologyex_940',['morphologyEx',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga67493776e3ad1a3df63883829375201f',1,'cv::morphologyEx()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga939a4d8afa86b012f6e3d006e6a32180',1,'cv::ximgproc::rl::morphologyEx()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga67493776e3ad1a3df63883829375201f',1,'morphologyEx(InputArray src, OutputArray dst, int op, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga939a4d8afa86b012f6e3d006e6a32180',1,'morphologyEx(InputArray rlSrc, OutputArray rlDest, int op, InputArray rlKernel, bool bBoundaryOnForErosion=true, Point anchor=Point(0, 0))(Global Namespace)']]], + ['morphshapes_941',['MorphShapes',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gac2db39b56866583a95a5680313c314ad',1,'cv::MorphShapes'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gac2db39b56866583a95a5680313c314ad',1,'MorphShapes(Global Namespace)']]], + ['morphtypes_942',['MorphTypes',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga7be549266bad7b2e6a04db49827f9f32',1,'cv::MorphTypes'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga7be549266bad7b2e6a04db49827f9f32',1,'MorphTypes(Global Namespace)']]], + ['mos_943',['mos',['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html#a4cf5763d3653ab631cbf6afa32dbf9f3',1,'cv::gapi::wip::draw::Mosaic']]], + ['mosaic_944',['Mosaic',['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html',1,'cv::gapi::wip::draw::Mosaic'],['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html#ad655ea1c3d0eff93300e5cbcbbe434b6',1,'cv::gapi::wip::draw::Mosaic::Mosaic()']]], + ['motempl_2ehpp_945',['motempl.hpp',['https://docs.opencv.org/4.2.0/da/d48/motempl_8hpp.html',1,'']]], + ['motion_946',['Motion',['https://docs.opencv.org/4.2.0/d8/d8c/group__sfm.html',1,'Structure From Motion'],['https://docs.opencv.org/4.2.0/de/d7c/tutorial_table_of_content_sfm.html',1,'Structure From Motion']]], + ['motion_20analysis_947',['Motion Analysis',['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html',1,'']]], + ['motion_20analysis_20and_20object_20tracking_948',['Motion Analysis and Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'']]], + ['motion_20deblur_20filter_949',['Motion Deblur Filter',['https://docs.opencv.org/4.2.0/d1/dfd/tutorial_motion_deblur_filter.html',1,'']]], + ['motion_20estimation_950',['Motion Estimation',['https://docs.opencv.org/4.2.0/d5/dab/tutorial_sfm_trajectory_estimation.html',1,'Camera Motion Estimation'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html',1,'Global Motion Estimation']]], + ['motion_5faffine_951',['MOTION_AFFINE',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809faa22eb135b6afe090a8a0d228fd62634a',1,'cv::MOTION_AFFINE'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809faa22eb135b6afe090a8a0d228fd62634a',1,'MOTION_AFFINE(Global Namespace)']]], + ['motion_5faffinity_5fw_952',['motion_affinity_w',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a487649d2cd4c0e9a94c0f7a9e0fa3ba2',1,'cv::tbm::TrackerParams']]], + ['motion_5fcore_2ehpp_953',['motion_core.hpp',['https://docs.opencv.org/4.2.0/de/d4e/motion__core_8hpp.html',1,'']]], + ['motion_5fdeblur_5ffilter_2emarkdown_954',['motion_deblur_filter.markdown',['https://docs.opencv.org/4.2.0/d9/d0d/motion__deblur__filter_8markdown.html',1,'']]], + ['motion_5festimators_2ehpp_955',['motion_estimators.hpp',['https://docs.opencv.org/4.2.0/d3/d73/motion__estimators_8hpp.html',1,'']]], + ['motion_5feuclidean_956',['MOTION_EUCLIDEAN',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809fa075fb2a93001cb4cc1ba1b22af1e8848',1,'cv::MOTION_EUCLIDEAN'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809fa075fb2a93001cb4cc1ba1b22af1e8848',1,'MOTION_EUCLIDEAN(Global Namespace)']]], + ['motion_5fhomography_957',['MOTION_HOMOGRAPHY',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809fa81a5e999a7fde5656ce1ca0458741b27',1,'cv::MOTION_HOMOGRAPHY'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809fa81a5e999a7fde5656ce1ca0458741b27',1,'MOTION_HOMOGRAPHY(Global Namespace)']]], + ['motion_5fstabilizing_2ehpp_958',['motion_stabilizing.hpp',['https://docs.opencv.org/4.2.0/da/d38/motion__stabilizing_8hpp.html',1,'']]], + ['motion_5ftranslation_959',['MOTION_TRANSLATION',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809fa01106d6d20122b782ff25eaeffe9a5be',1,'cv::MOTION_TRANSLATION'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ggae253527fb2e417b9157e9c5d5561809fa01106d6d20122b782ff25eaeffe9a5be',1,'MOTION_TRANSLATION(Global Namespace)']]], + ['motionestimator_960',['motionEstimator',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a8ab5adc5cefe91ef4397bd2d01111b26',1,'cv::videostab::StabilizerBase::motionEstimator()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#ab4290a6b6ae538ca60c644cb7cf34038',1,'cv::videostab::WobbleSuppressorBase::motionEstimator()']]], + ['motionestimator_5f_961',['motionEstimator_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ad668ce4753c5633eab4704eda99c2936',1,'cv::videostab::StabilizerBase::motionEstimator_'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#aef9a4674e65b999cd96a1c4ef756c3a1',1,'cv::videostab::WobbleSuppressorBase::motionEstimator_']]], + ['motionestimatorbase_962',['MotionEstimatorBase',['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html',1,'cv::videostab::MotionEstimatorBase'],['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html#ab1bc0253fe2d279148445e0e2f42c508',1,'cv::videostab::MotionEstimatorBase::MotionEstimatorBase()']]], + ['motionestimatorl1_963',['MotionEstimatorL1',['https://docs.opencv.org/4.2.0/d7/d29/classcv_1_1videostab_1_1MotionEstimatorL1.html',1,'cv::videostab::MotionEstimatorL1'],['https://docs.opencv.org/4.2.0/d7/d29/classcv_1_1videostab_1_1MotionEstimatorL1.html#adc5c868f661775fb37a31a51ab1ea0d7',1,'cv::videostab::MotionEstimatorL1::MotionEstimatorL1()']]], + ['motionestimatorransacl2_964',['MotionEstimatorRansacL2',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html',1,'cv::videostab::MotionEstimatorRansacL2'],['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#ae7d9545b45bc537042cdc4251a8237ca',1,'cv::videostab::MotionEstimatorRansacL2::MotionEstimatorRansacL2()']]], + ['motionfilter_965',['motionFilter',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#a3b34bc7dc9c291f603aacb971fe41ee5',1,'cv::videostab::OnePassStabilizer']]], + ['motionfilter_5f_966',['motionFilter_',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#a6d98abb6281250f3c56b249e4af0ae19',1,'cv::videostab::OnePassStabilizer']]], + ['motionfilterbase_967',['MotionFilterBase',['https://docs.opencv.org/4.2.0/dd/df4/classcv_1_1videostab_1_1MotionFilterBase.html',1,'cv::videostab']]], + ['motionfromessential_968',['motionFromEssential',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaee634880c5f298096ab2fc514de87cbd',1,'cv::sfm::motionFromEssential()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaee634880c5f298096ab2fc514de87cbd',1,'motionFromEssential()(Global Namespace)']]], + ['motionfromessentialchoosesolution_969',['motionFromEssentialChooseSolution',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga6bd98cb968781abf62659eedc0d0481e',1,'cv::sfm::motionFromEssentialChooseSolution()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga6bd98cb968781abf62659eedc0d0481e',1,'motionFromEssentialChooseSolution()(Global Namespace)']]], + ['motioninpainter_970',['MotionInpainter',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html',1,'cv::videostab::MotionInpainter'],['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#aebf592dca89ac5e3f3cf94180b1fcad4',1,'cv::videostab::MotionInpainter::MotionInpainter()']]], + ['motionmodel_971',['MotionModel',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#gac61e59db30b7d13983885d3ad3116ce1',1,'cv::videostab::MotionModel'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#gac61e59db30b7d13983885d3ad3116ce1',1,'MotionModel(Global Namespace)']]], + ['motionmodel_972',['motionModel',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html#a841d954ea87bc9453590180096b36646',1,'cv::videostab::ImageMotionEstimatorBase::motionModel()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a0ad21d4676d5e0d07766f124f90b1a7e',1,'cv::videostab::InpainterBase::motionModel()'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#aef396847ece742047bcf40a415ffa898',1,'cv::videostab::KeypointBasedMotionEstimator::motionModel()'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a29e99ca5a23db566de09744a291363c5',1,'cv::videostab::LpMotionStabilizer::motionModel()'],['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html#a7a848cee402585520565e8346221af68',1,'cv::videostab::MotionEstimatorBase::motionModel()'],['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html#ac7c4c2596a7b18602ec444f4c3642409',1,'cv::videostab::ToFileMotionWriter::motionModel()']]], + ['motionmodel_5f_973',['motionModel_',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a9aaefb1f57fb4ca73438b391473206c7',1,'cv::videostab::InpainterBase']]], + ['motions_974',['motions',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a03c5fbf6b554fa16313e5966d4f650a9',1,'cv::videostab::DeblurerBase::motions()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#acd8158287f603009374c282ce20ccc95',1,'cv::videostab::InpainterBase::motions()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a4f646cec10ba28feddd082134edf2a60',1,'cv::videostab::WobbleSuppressorBase::motions() const']]], + ['motions2_975',['motions2',['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#ad60cdff01ba2c03f41000bcfa422b97b',1,'cv::videostab::WobbleSuppressorBase']]], + ['motions2_5f_976',['motions2_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#aba137eabaa62e57971247c939d447e08',1,'cv::videostab::TwoPassStabilizer::motions2_'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a5de5527f05d3a691f0d8bdd1111d857d',1,'cv::videostab::WobbleSuppressorBase::motions2_']]], + ['motions_5f_977',['motions_',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a076bf2cf50f92bc5e0684810179ed71c',1,'cv::videostab::DeblurerBase::motions_'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a464def3695a8ef1ff91666e896ee1005',1,'cv::videostab::InpainterBase::motions_'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a0f134ba4672305e6949a62cdfd8b8d36',1,'cv::videostab::StabilizerBase::motions_'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#aeab365b7e78c874fce96294716638687',1,'cv::videostab::WobbleSuppressorBase::motions_']]], + ['motionsaliency_978',['MotionSaliency',['https://docs.opencv.org/4.2.0/d2/df7/classcv_1_1saliency_1_1MotionSaliency.html',1,'cv::saliency']]], + ['motionsaliencybinwangapr2014_979',['MotionSaliencyBinWangApr2014',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html',1,'cv::saliency::MotionSaliencyBinWangApr2014'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a48791bfcad75fa0572683f23a2fbb3c8',1,'cv::saliency::MotionSaliencyBinWangApr2014::MotionSaliencyBinWangApr2014()']]], + ['motionstabilizationpipeline_980',['MotionStabilizationPipeline',['https://docs.opencv.org/4.2.0/d9/d76/classcv_1_1videostab_1_1MotionStabilizationPipeline.html',1,'cv::videostab']]], + ['motionstabilizer_981',['motionStabilizer',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a7d5d9714f66ed34381f21f9e416a3c75',1,'cv::videostab::TwoPassStabilizer']]], + ['motionstabilizer_5f_982',['motionStabilizer_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#ab46fac67a00e7184077111bc8e6a560d',1,'cv::videostab::TwoPassStabilizer']]], + ['motorid_5ft_983',['motorid_t',['../namespacerobot_1_1types.html#a7278b81a300fa12b4b6525bff976f190',1,'robot::types']]], + ['motormode_5ft_984',['motormode_t',['../namespacecan_1_1motor.html#a74e4e1121ce20fb929e82f4d5caed88b',1,'can::motor']]], + ['motorpidmap_985',['motorPIDMap',['../namespacerobot.html#ac1eaa5d6745c8aad93d6304c0f8b1821',1,'robot']]], + ['motorserialidmap_986',['motorSerialIDMap',['../namespacerobot.html#aa66a3a3666eb218c89671933350db78f',1,'robot']]], + ['mountedperipheral_5ft_987',['mountedperipheral_t',['../namespacerobot_1_1types.html#aa93c10246999d2fdb71ba7bdb792c235',1,'robot::types']]], + ['mouse_20as_20a_20paint_20brush_988',['Mouse as a Paint-Brush',['https://docs.opencv.org/4.2.0/db/d5b/tutorial_py_mouse_handling.html',1,'']]], + ['mousebutton_989',['MouseButton',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#ada240f2528500ad1615e76fb2fd9e2ba',1,'cv::viz::MouseEvent']]], + ['mousebuttonpress_990',['MouseButtonPress',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39ac8445731d7e6930f745a303acea1d1e5',1,'cv::viz::MouseEvent']]], + ['mousebuttonrelease_991',['MouseButtonRelease',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39afa027c59ebbc0dd8f412d55e39556ceb',1,'cv::viz::MouseEvent']]], + ['mousecallback_992',['MouseCallback',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a11e6194c24c4816e963fc704f3d0c36a',1,'cv::viz::Viz3d::MouseCallback'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gab7aed186e151d5222ef97192912127a4',1,'cv::MouseCallback'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gab7aed186e151d5222ef97192912127a4',1,'MouseCallback(Global Namespace)']]], + ['mousedblclick_993',['MouseDblClick',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39a819bad74662968724aa3909679ee69b9',1,'cv::viz::MouseEvent']]], + ['mouseevent_994',['MouseEvent',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html',1,'cv::viz::MouseEvent'],['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a2566c9701613232f23ba6d9bae559853',1,'cv::viz::MouseEvent::MouseEvent()']]], + ['mouseeventflags_995',['MouseEventFlags',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gaab4dc057947f70058c80626c9f1c25ce',1,'cv::MouseEventFlags'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gaab4dc057947f70058c80626c9f1c25ce',1,'MouseEventFlags(Global Namespace)']]], + ['mouseeventtypes_996',['MouseEventTypes',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga927593befdddc7e7013602bca9b079b0',1,'cv::MouseEventTypes'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga927593befdddc7e7013602bca9b079b0',1,'MouseEventTypes(Global Namespace)']]], + ['mousemove_997',['MouseMove',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39a2099ae3377b1e50e784da3910e0508dd',1,'cv::viz::MouseEvent']]], + ['mousescrolldown_998',['MouseScrollDown',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39a37899e1ded68a942b8b91fc85a95b488',1,'cv::viz::MouseEvent']]], + ['mousescrollup_999',['MouseScrollUp',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39a0b60ae14d045a90a6680e6ad33fd45d7',1,'cv::viz::MouseEvent']]], + ['mov_1000',['mov',['https://docs.opencv.org/4.2.0/df/d63/classcv_1_1detail_1_1BasicVectorRef.html#aa176aefc4d3a43adba8fda62632e1f1c',1,'cv::detail::BasicVectorRef::mov()'],['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html#a51c97bca58c3b1894fa588e45dcdf370',1,'cv::detail::VectorRef::mov()'],['https://docs.opencv.org/4.2.0/d2/dab/classcv_1_1detail_1_1VectorRefT.html#a91343bb7c3b8bd2960721ef84d778dcc',1,'cv::detail::VectorRefT::mov()']]], + ['move_1001',['move',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ab6a8109eb6c9bb2e04fe32247d32eb59',1,'cv::_OutputArray::move(UMat &u) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ab185427c5ad1b0a5c75a0eae05171663',1,'cv::_OutputArray::move(Mat &m) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9f81219bfbfaac50d44f79095a639620',1,'std::move(_Tp &&__t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaedffc88b77674cbf9966e30a9c275bb6',1,'std::move(_II __first, _II __last, _OI __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaedffc88b77674cbf9966e30a9c275bb6',1,'move(_II __first, _II __last, _OI __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9f81219bfbfaac50d44f79095a639620',1,'move(_Tp &&__t) noexcept(Global Namespace)']]], + ['move_2eh_1002',['move.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00425.html',1,'']]], + ['move_5fbackward_1003',['move_backward',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga1743475fe627f5302b98ae41f8bf0ad5',1,'std::move_backward()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga1743475fe627f5302b98ae41f8bf0ad5',1,'move_backward()(Global Namespace)']]], + ['move_5fif_5fnoexcept_1004',['move_if_noexcept',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gad065507b1d170a56e1ee2c77251554a3',1,'std::move_if_noexcept()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gad065507b1d170a56e1ee2c77251554a3',1,'move_if_noexcept()(Global Namespace)']]], + ['move_5fiterator_1005',['move_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07675.html',1,'std']]], + ['movewindow_1006',['moveWindow',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8d86b207f7211250dbe6e28f76307ffb',1,'cv::moveWindow()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8d86b207f7211250dbe6e28f76307ffb',1,'moveWindow()(Global Namespace)']]], + ['mp_1007',['MP',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a658b2984b9a64a01deabd9420eb70d7d',1,'cv::tracking::UnscentedKalmanFilterParams']]], + ['mpeg1_1008',['MPEG1',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a76b84b89602cb58f49870dcc45a8b8cc',1,'cv::cudacodec::MPEG1'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a76b84b89602cb58f49870dcc45a8b8cc',1,'MPEG1(Global Namespace)']]], + ['mpeg2_1009',['MPEG2',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146ab8ff0b5ad78506988d6138ea88e96b5a',1,'cv::cudacodec::MPEG2'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146ab8ff0b5ad78506988d6138ea88e96b5a',1,'MPEG2(Global Namespace)']]], + ['mpeg4_1010',['MPEG4',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a9948c662291bfed72125faca82012e3f',1,'cv::cudacodec::MPEG4'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a9948c662291bfed72125faca82012e3f',1,'MPEG4(Global Namespace)']]], + ['msa_5fmacros_2eh_1011',['msa_macros.h',['https://docs.opencv.org/4.2.0/d3/d86/msa__macros_8h.html',1,'']]], + ['msddetector_1012',['MSDDetector',['https://docs.opencv.org/4.2.0/d0/dcf/classcv_1_1xfeatures2d_1_1MSDDetector.html',1,'cv::xfeatures2d']]], + ['mser_1013',['MSER',['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html',1,'cv']]], + ['mserstoerstats_1014',['MSERsToERStats',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gaa40b490a66fa21eb1d89163202f69c86',1,'cv::text::MSERsToERStats()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gaa40b490a66fa21eb1d89163202f69c86',1,'MSERsToERStats()(Global Namespace)']]], + ['msg_1015',['msg',['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a7ead458b4fc88ebca20b231383c49845',1,'cv::Exception']]], + ['mslic_1016',['MSLIC',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gga6c6f7deab0bd328066f0ada72c2ce57ba7f820d4b97c57b9d42dfa862a8ab347a',1,'cv::ximgproc::MSLIC'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gga6c6f7deab0bd328066f0ada72c2ce57ba7f820d4b97c57b9d42dfa862a8ab347a',1,'MSLIC(Global Namespace)']]], + ['msm_5fepfl_1017',['MSM_epfl',['https://docs.opencv.org/4.2.0/dc/de4/classcv_1_1datasets_1_1MSM__epfl.html',1,'cv::datasets']]], + ['msm_5fepfl_2ehpp_1018',['msm_epfl.hpp',['https://docs.opencv.org/4.2.0/d6/d8b/msm__epfl_8hpp.html',1,'']]], + ['msm_5fepflobj_1019',['MSM_epflObj',['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html',1,'cv::datasets']]], + ['msm_5fmiddlebury_1020',['MSM_middlebury',['https://docs.opencv.org/4.2.0/d2/dcc/classcv_1_1datasets_1_1MSM__middlebury.html',1,'cv::datasets']]], + ['msm_5fmiddlebury_2ehpp_1021',['msm_middlebury.hpp',['https://docs.opencv.org/4.2.0/d6/d0b/msm__middlebury_8hpp.html',1,'']]], + ['msm_5fmiddleburyobj_1022',['MSM_middleburyObj',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1datasets_1_1MSM__middleburyObj.html',1,'cv::datasets']]], + ['mt19937_1023',['mt19937',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga887bdc65ea12ca4f83aa79f5bd9fce03',1,'std::mt19937'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga887bdc65ea12ca4f83aa79f5bd9fce03',1,'mt19937(Global Namespace)']]], + ['mt19937_5f64_1024',['mt19937_64',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga9606c7ecfbdedbd7ee5d8b908f4e2275',1,'std::mt19937_64'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga9606c7ecfbdedbd7ee5d8b908f4e2275',1,'mt19937_64(Global Namespace)']]], + ['mt_5fallocator_2eh_1025',['mt_allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01058.html',1,'']]], + ['mu_1026',['mu',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a0d807e56ef6d7a718c9bec8b86557b94',1,'cv::quality::QualitySSIM::_mat_data']]], + ['mu02_1027',['mu02',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#adcde8be49f73216d06965df0a884239b',1,'cv::Moments']]], + ['mu03_1028',['mu03',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#aa4072d2fd03bc6cdee8a5c0e15fe1b4f',1,'cv::Moments']]], + ['mu11_1029',['mu11',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a9afade2efe8ec13e8874acc43f274bf8',1,'cv::Moments']]], + ['mu12_1030',['mu12',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a811cdd7ac5c644f4678c3d9f1601b44d',1,'cv::Moments']]], + ['mu20_1031',['mu20',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a1f437e60fd477d2ea4b5a3f0c2b8a9d4',1,'cv::Moments']]], + ['mu21_1032',['mu21',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#aba659bac5ac0ff32cf3ad160d0d3b23e',1,'cv::Moments']]], + ['mu30_1033',['mu30',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a1fc9b5378cb0d4c0af043e991b79f96a',1,'cv::Moments']]], + ['mu_5f2_1034',['mu_2',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a32d0762845029dfb5ea76fd78daf8361',1,'cv::quality::QualitySSIM::_mat_data']]], + ['mul_1035',['mul',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a385c09827713dc3e6d713bfad8460706',1,'cv::Mat::mul()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0e80cbf0fa6ed1187294697ab2b674ca',1,'cv::MatExpr::mul(const MatExpr &e, double scale=1) const'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a3be890f1c079879bbd106050972f24ea',1,'cv::MatExpr::mul(const Mat &m, double scale=1) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'cv::Matx::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< _Tp, cn, 1 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 1, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 2, 2 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 2, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 3, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 3, 4 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 4, 4 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, cn, 1 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float, 2, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float, 3, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float, cn, 1 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float_type, 4, 4 >::mul()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a0ef9335f112158eed19fd91fac110414',1,'cv::Scalar_::mul()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a0ef9335f112158eed19fd91fac110414',1,'Scalar_< double >::mul()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#af50d8160ca05a304b30c1dd64ae20755',1,'cv::UMat::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'cv::Vec::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< _Tp, 4 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, 2 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, 3 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, 4 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, GPCPatchDescriptor::nFeatures >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, nFeatures >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< float, 2 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< float, 3 >::mul()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga42a8187b2bf350f90e4a31f93e929e51',1,'cv::gapi::mul()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga42a8187b2bf350f90e4a31f93e929e51',1,'mul()(Global Namespace)']]], + ['mul16s_1036',['mul16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8fb6f980b109edb1e4e0107334693ac9',1,'cv::hal::mul16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8fb6f980b109edb1e4e0107334693ac9',1,'mul16s()(Global Namespace)']]], + ['mul16u_1037',['mul16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga242229fc8cc1fe5f840c737fc8d27e77',1,'cv::hal::mul16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga242229fc8cc1fe5f840c737fc8d27e77',1,'mul16u()(Global Namespace)']]], + ['mul32f_1038',['mul32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1a577a4621637502343531e62aba9e4',1,'cv::hal::mul32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1a577a4621637502343531e62aba9e4',1,'mul32f()(Global Namespace)']]], + ['mul32s_1039',['mul32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga87426b5ce323eee5c97f92f082df8c5c',1,'cv::hal::mul32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga87426b5ce323eee5c97f92f082df8c5c',1,'mul32s()(Global Namespace)']]], + ['mul64f_1040',['mul64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38bd2b62ad3fa7906495708f82d16718',1,'cv::hal::mul64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38bd2b62ad3fa7906495708f82d16718',1,'mul64f()(Global Namespace)']]], + ['mul8s_1041',['mul8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacf694c2099ea3046ff44575570235fc4',1,'cv::hal::mul8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacf694c2099ea3046ff44575570235fc4',1,'mul8s()(Global Namespace)']]], + ['mul8u_1042',['mul8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3dd47e9d72de2668e8a1ae6b5ec99b29',1,'cv::hal::mul8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3dd47e9d72de2668e8a1ae6b5ec99b29',1,'mul8u()(Global Namespace)']]], + ['muladd_1043',['mulAdd',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafe33592336ab4182d98316e65a151ccd',1,'cv::mulAdd(const softfloat &a, const softfloat &b, const softfloat &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafd3f019e0be823233d1a74330e3b2849',1,'cv::mulAdd(const softdouble &a, const softdouble &b, const softdouble &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafe33592336ab4182d98316e65a151ccd',1,'mulAdd(const softfloat &a, const softfloat &b, const softfloat &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafd3f019e0be823233d1a74330e3b2849',1,'mulAdd(const softdouble &a, const softdouble &b, const softdouble &c)(Global Namespace)']]], + ['mulandscalespectrums_1044',['mulAndScaleSpectrums',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga5704c25b8be4f19da812e6d98c8ee464',1,'cv::cuda::mulAndScaleSpectrums()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga5704c25b8be4f19da812e6d98c8ee464',1,'mulAndScaleSpectrums()(Global Namespace)']]], + ['mulc_1045',['mulC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa924c8c082e0476e4d846843d5f8bed3',1,'cv::gapi::mulC(const GMat &src, double multiplier, int ddepth=-1)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga173028247b9426f6e744c18df02c10f1',1,'cv::gapi::mulC(const GMat &src, const GScalar &multiplier, int ddepth=-1)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga29ed07435c1ab0da02627303594a9b73',1,'cv::gapi::mulC(const GScalar &multiplier, const GMat &src, int ddepth=-1)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa924c8c082e0476e4d846843d5f8bed3',1,'mulC(const GMat &src, double multiplier, int ddepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga173028247b9426f6e744c18df02c10f1',1,'mulC(const GMat &src, const GScalar &multiplier, int ddepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga29ed07435c1ab0da02627303594a9b73',1,'mulC(const GScalar &multiplier, const GMat &src, int ddepth=-1)(Global Namespace)']]], + ['mulspectrums_1046',['mulSpectrums',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3ab38646463c59bf0ce962a9d51db64f',1,'cv::mulSpectrums()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#gab3e8900d67c4f59bdc137a0495206cd8',1,'cv::cuda::mulSpectrums()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3ab38646463c59bf0ce962a9d51db64f',1,'mulSpectrums(InputArray a, InputArray b, OutputArray c, int flags, bool conjB=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#gab3e8900d67c4f59bdc137a0495206cd8',1,'mulSpectrums(InputArray src1, InputArray src2, OutputArray dst, int flags, bool conjB=false, Stream &stream=Stream::Null())(Global Namespace)']]], + ['multi_20camera_20calibration_1047',['Multi-camera Calibration',['https://docs.opencv.org/4.2.0/d2/d1c/tutorial_multi_camera_main.html',1,'']]], + ['multi_20dimensional_20spaces_1048',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], + ['multi_20output_1049',['Upscaling images: multi-output',['https://docs.opencv.org/4.2.0/d6/dca/tutorial_dnn_superres_upscale_image_multi.html',1,'']]], + ['multi_20threading_1050',['Eigen and multi-threading',['https://eigen.tuxfamily.org/dox/TopicMultiThreading.html',1,'']]], + ['multi_5fband_1051',['MULTI_BAND',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#af4aa7ccea7ea77db1cead36f46ff6aafa2561f45ebefa078e121969723c3d2753',1,'cv::detail::Blender']]], + ['multi_5fcamera_5ftutorial_2emarkdown_1052',['multi_camera_tutorial.markdown',['https://docs.opencv.org/4.2.0/d3/d8e/multi__camera__tutorial_8markdown.html',1,'']]], + ['multi_5fstep_1053',['MULTI_STEP',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#gga6a4ee3a5f9fd35c1b350a1049d8abc9dac76aa06a768ef2d483abe5db77cabd39',1,'cv::ft::MULTI_STEP'],['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#gga6a4ee3a5f9fd35c1b350a1049d8abc9dac76aa06a768ef2d483abe5db77cabd39',1,'MULTI_STEP(Global Namespace)']]], + ['multibandblender_1054',['MultiBandBlender',['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html',1,'cv::detail::MultiBandBlender'],['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html#a22b424c9587d07da189cd1f15c664424',1,'cv::detail::MultiBandBlender::MultiBandBlender()']]], + ['multicalib_2ehpp_1055',['multicalib.hpp',['https://docs.opencv.org/4.2.0/d6/d51/multicalib_8hpp.html',1,'']]], + ['multicameracalibration_1056',['MultiCameraCalibration',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html',1,'cv::multicalib::MultiCameraCalibration'],['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#a8fefc924b521891bfe9affebefd2ccbc',1,'cv::multicalib::MultiCameraCalibration::MultiCameraCalibration()']]], + ['multimap_1057',['multimap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08731.html',1,'std::__debug::multimap< _Key, _Tp, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08927.html',1,'std::__profile::multimap< _Key, _Tp, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html',1,'std::multimap< _Key, _Tp, _Compare, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#acf3e6ab93785da86f181b584656de15d',1,'std::multimap::multimap()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1b00cb262efce13e4e5c323732c13109',1,'std::multimap::multimap(const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a75ee670e7ff1b74c62d3443ec05a9e4b',1,'std::multimap::multimap(const multimap &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#acbad3010aae4c8ce7ceb97ec5e2daff9',1,'std::multimap::multimap(multimap &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a64de4362141668b6b36fb6a399dbc9d4',1,'std::multimap::multimap(initializer_list< value_type > __l, const _Compare &__comp=_Compare(), const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a0ae31ea18b1274e6e6409795ae5286eb',1,'std::multimap::multimap(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a8105fc127e9fc15e90a050d7e0f7f11a',1,'std::multimap::multimap(const multimap &__m, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1093b678ea48aa26495ce2bbaf5dd4d7',1,'std::multimap::multimap(multimap &&__m, const allocator_type &__a) noexcept(is_nothrow_copy_constructible< _Compare >::value &&_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#aac222575af5d9600a5651357a978ecd6',1,'std::multimap::multimap(initializer_list< value_type > __l, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a4e1269440d1164dc556209ee07982358',1,'std::multimap::multimap(_InputIterator __first, _InputIterator __last, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ab2d27f68df308a944b432dbf91433e46',1,'std::multimap::multimap(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad11e806c3a5c1db4b888eac55459bbb3',1,'std::multimap::multimap(_InputIterator __first, _InputIterator __last, const _Compare &__comp, const allocator_type &__a=allocator_type())']]], + ['multiplication_1058',['Matrix multiplication',['https://docs.opencv.org/4.2.0/d2/dab/group__core__hal__interface__matrix__multiplication.html',1,'']]], + ['multiplier_1059',['multiplier',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a5f6ca5414f03b35e0a82731cf9cd6496',1,'std::linear_congruential_engine']]], + ['multiplies_1060',['multiplies',['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1cudev_1_1multiplies.html',1,'cv::cudev::multiplies< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07363.html',1,'std::multiplies< class >']]], + ['multiplies_3c_20void_20_3e_1061',['multiplies< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07387.html',1,'std']]], + ['multiply_1062',['multiply',['https://docs.opencv.org/4.2.0/de/db7/group__core__hal__interface__multiply.html',1,'Element-wise multiply'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ac5a4ac08519b8229bfa99fba68f3bdc2',1,'cv::MatOp::multiply(const MatExpr &expr1, const MatExpr &expr2, MatExpr &res, double scale=1) const'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a5c992cafa34003955815dcaf95f5e745',1,'cv::MatOp::multiply(const MatExpr &expr1, double s, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga979d898a58d7f61c53003e162e7ad89f',1,'cv::multiply()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga497cc0615bf717e1e615143b56f00591',1,'cv::cuda::multiply()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga979d898a58d7f61c53003e162e7ad89f',1,'multiply(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga497cc0615bf717e1e615143b56f00591',1,'multiply(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1, Stream &stream=Stream::Null())(Global Namespace)']]], + ['multiprocessorcount_1063',['multiProcessorCount',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8b4c6b2aed8ee5285bff0e42746fa363',1,'cv::cuda::DeviceInfo']]], + ['multisensorekf_1064',['MultiSensorEKF',['../classfilters_1_1MultiSensorEKF.html',1,'filters']]], + ['multiseq_5fpartition_1065',['multiseq_partition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ade1f4c5da0794c4f1a09465d4aee6c1d',1,'__gnu_parallel']]], + ['multiseq_5fselection_1066',['multiseq_selection',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a68f665a2f83172d9e12b8332ce573d5d',1,'__gnu_parallel']]], + ['multiseq_5fselection_2eh_1067',['multiseq_selection.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00920.html',1,'']]], + ['multiset_1068',['multiset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08735.html',1,'std::__debug::multiset< _Key, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08931.html',1,'std::__profile::multiset< _Key, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html',1,'std::multiset< _Key, _Compare, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a694c6f511cd8cd15e116062bcaef1dc4',1,'std::multiset::multiset()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a38e27d171934c562e8f5fc48fba81564',1,'std::multiset::multiset(const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ac561d1612797aaf6022b371cce116035',1,'std::multiset::multiset(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae6acd6b5095c21d2a04c7d9afa6b02ab',1,'std::multiset::multiset(_InputIterator __first, _InputIterator __last, const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aeed9cc573fe8a3346634b3f28dda12a2',1,'std::multiset::multiset(const multiset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a851d2cffcf7183d7a16423d4964f8047',1,'std::multiset::multiset(multiset &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#adad316ede7ac22b3eff955eb6d9ab327',1,'std::multiset::multiset(initializer_list< value_type > __l, const _Compare &__comp=_Compare(), const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae8a1847b51c056d1abbc01fb76742632',1,'std::multiset::multiset(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a3ada945ca3237945e666bdc541accba1',1,'std::multiset::multiset(const multiset &__m, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a0bf2a4cf104ce19a863ac0438e1d3070',1,'std::multiset::multiset(multiset &&__m, const allocator_type &__a) noexcept(is_nothrow_copy_constructible< _Compare >::value &&_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a4bd596fbcfa91841dc0bfe442177c5ac',1,'std::multiset::multiset(initializer_list< value_type > __l, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a15b3f5d46a91d60ee98c0ac7f278476a',1,'std::multiset::multiset(_InputIterator __first, _InputIterator __last, const allocator_type &__a)']]], + ['multitracker_1069',['MultiTracker',['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html',1,'cv::MultiTracker'],['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html#a919f18c31b860b5b20e372881b9f2265',1,'cv::MultiTracker::MultiTracker()'],['https://docs.opencv.org/4.2.0/d5/d07/tutorial_multitracker.html',1,'Using MultiTracker']]], + ['multitracker_5falt_1070',['MultiTracker_Alt',['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html',1,'cv::MultiTracker_Alt'],['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html#a24a9ebc9e0753576a13f8437e88b08e0',1,'cv::MultiTracker_Alt::MultiTracker_Alt()']]], + ['multitrackertld_1071',['MultiTrackerTLD',['https://docs.opencv.org/4.2.0/d2/d33/classcv_1_1MultiTrackerTLD.html',1,'cv']]], + ['multiview_20stereo_20matching_1072',['Multiview Stereo Matching',['https://docs.opencv.org/4.2.0/d7/dd5/group__datasets__msm.html',1,'']]], + ['multiway_5fmerge_1073',['multiway_merge',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a25294b0a47406aefa9ebc5e0c151d0ce',1,'__gnu_parallel']]], + ['multiway_5fmerge_2eh_1074',['multiway_merge.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00923.html',1,'']]], + ['multiway_5fmerge_5f3_5fvariant_1075',['multiway_merge_3_variant',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a7ee9d79b73a6f85ae97e472312ba411e',1,'__gnu_parallel']]], + ['multiway_5fmerge_5f4_5fvariant_1076',['multiway_merge_4_variant',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ac4af8f9977aa36823357bce35be6c946',1,'__gnu_parallel']]], + ['multiway_5fmerge_5fexact_5fsplitting_1077',['multiway_merge_exact_splitting',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a567621588e461a8759651e29cd964ab9',1,'__gnu_parallel']]], + ['multiway_5fmerge_5floser_5ftree_1078',['multiway_merge_loser_tree',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a150b06a4da2cf1cff673d1b6242c27fa',1,'__gnu_parallel']]], + ['multiway_5fmerge_5floser_5ftree_5fsentinel_1079',['multiway_merge_loser_tree_sentinel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a686704fa4da0a4fdbc6800fe46048366',1,'__gnu_parallel']]], + ['multiway_5fmerge_5floser_5ftree_5funguarded_1080',['multiway_merge_loser_tree_unguarded',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a3ffd0c9da50da6118291d38f95d44b52',1,'__gnu_parallel']]], + ['multiway_5fmerge_5fminimal_5fk_1081',['multiway_merge_minimal_k',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a4859415fa2642fbdf9324007b75b020e',1,'__gnu_parallel::_Settings']]], + ['multiway_5fmerge_5fminimal_5fn_1082',['multiway_merge_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a15bef2dad4920451b8eb798ccdbf68f8',1,'__gnu_parallel::_Settings']]], + ['multiway_5fmerge_5foversampling_1083',['multiway_merge_oversampling',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#aa514e4bd6da6380bf7526c5306d6b173',1,'__gnu_parallel::_Settings']]], + ['multiway_5fmerge_5fsampling_5fsplitting_1084',['multiway_merge_sampling_splitting',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a0e39d3891745fd0e244fb125bf34ce8b',1,'__gnu_parallel']]], + ['multiway_5fmerge_5fsentinels_1085',['multiway_merge_sentinels',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a4d6e76ac42b48f0033139352dcb0418f',1,'__gnu_parallel']]], + ['multiway_5fmergesort_2eh_1086',['multiway_mergesort.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00926.html',1,'']]], + ['multiway_5fmergesort_5fexact_5ftag_1087',['multiway_mergesort_exact_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09747.html',1,'__gnu_parallel']]], + ['multiway_5fmergesort_5fsampling_5ftag_1088',['multiway_mergesort_sampling_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09751.html',1,'__gnu_parallel']]], + ['multiway_5fmergesort_5ftag_1089',['multiway_mergesort_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09743.html',1,'__gnu_parallel']]], + ['multransposed_1090',['mulTransposed',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadc4e49f8f7a155044e3be1b9e3b270ab',1,'cv::mulTransposed()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadc4e49f8f7a155044e3be1b9e3b270ab',1,'mulTransposed()(Global Namespace)']]], + ['mustestimatetrimaratio_1091',['mustEstimateTrimaRatio',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a39dbf002bfc87325c45726288c278b97',1,'cv::videostab::TwoPassStabilizer']]], + ['mustesttrimratio_5f_1092',['mustEstTrimRatio_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a590f1fb1c89bb92f1e3a47ae11bc61c4',1,'cv::videostab::TwoPassStabilizer']]], + ['mutating_1093',['Mutating',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html',1,'Mutating'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html',1,'Non-Mutating']]], + ['mutex_1094',['Mutex',['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1utils_1_1lock__guard.html#aae883527d92cd4f675ec3ca71c3aaded',1,'cv::utils::lock_guard::Mutex'],['https://docs.opencv.org/4.2.0/d3/de8/classcv_1_1utils_1_1optional__lock__guard.html#a8adcabd3c8ee339c470662537e7d6d4e',1,'cv::utils::optional_lock_guard::Mutex'],['https://docs.opencv.org/4.2.0/d2/ddd/classcv_1_1utils_1_1optional__shared__lock__guard.html#ae4ac3ec60432043b4bbe8ed9be247e2a',1,'cv::utils::optional_shared_lock_guard::Mutex'],['https://docs.opencv.org/4.2.0/d9/d7f/classcv_1_1utils_1_1shared__lock__guard.html#a873b9d2ace40c6d53b1fa192144c8528',1,'cv::utils::shared_lock_guard::Mutex'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf0b2df4f7899189c9d04f7a2c2559132',1,'cv::Mutex'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf0b2df4f7899189c9d04f7a2c2559132',1,'Mutex(Global Namespace)']]], + ['mutex_1095',['mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07191.html',1,'std::mutex'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00110.html',1,'(Global Namespace)']]], + ['mutex_5f_1096',['mutex_',['https://docs.opencv.org/4.2.0/d2/ddd/classcv_1_1utils_1_1optional__shared__lock__guard.html#a9e8a790ebcf555301c94cb04022fb016',1,'cv::utils::optional_shared_lock_guard::mutex_'],['https://docs.opencv.org/4.2.0/d9/d7f/classcv_1_1utils_1_1shared__lock__guard.html#ab44a1a18cfef499c573ebc4acd44397d',1,'cv::utils::shared_lock_guard::mutex_']]], + ['mutexes_1097',['Mutexes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html',1,'']]], + ['mvkernel_1098',['MVKernel',['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html',1,'cv::stereo::MVKernel< num_images >'],['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#a9c14f938c0384395f268d3caa1211c41',1,'cv::stereo::MVKernel::MVKernel()'],['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#ad5be80bc8561c20b861bac19d54bf993',1,'cv::stereo::MVKernel::MVKernel(uint8_t **images, int **integral)']]], + ['mvnlayer_1099',['MVNLayer',['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html',1,'cv::dnn']]], + ['mysum_1100',['mySum',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a837849d3551e7b76e6f67d602b37ecd1',1,'cv::cudev::NormHamming::mySum'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#ad0cb3f5cd921d2ce68a6c1c109bf2ddc',1,'cv::cudev::NormL1::mySum'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#ae34ebae2fa946238cfff562ad52f543f',1,'cv::cudev::NormL1< float >::mySum'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#a9f5a7088b96f05fd624caae1d041c2d5',1,'cv::cudev::NormL2::mySum']]] ]; diff --git a/search/all_17.js b/search/all_17.js index a7519985..34049d7a 100644 --- a/search/all_17.js +++ b/search/all_17.js @@ -153,8 +153,8 @@ var searchData= ['nearestmarkercorners_150',['nearestMarkerCorners',['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html#ac530b2d00d82940f85124a46369acc4d',1,'cv::aruco::CharucoBoard']]], ['nearestmarkeridx_151',['nearestMarkerIdx',['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html#a0542ea3c5889d1a8b6610ed6c07fb4ad',1,'cv::aruco::CharucoBoard']]], ['needed_152',['needed',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a2ef2667f36017be9379d95fc5f421976',1,'cv::_OutputArray']]], - ['neg_153',['neg',['https://docs.opencv.org/4.2.0/d4/d6a/structcv_1_1optflow_1_1GPCPatchSample.html#ac349003c6aeac96618e985202601e078',1,'cv::optflow::GPCPatchSample']]], - ['neg_154',['NEG',['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba8382530f5229c7220c0b0f2628334019',1,'cv::datasets::NEG'],['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba8382530f5229c7220c0b0f2628334019',1,'NEG(Global Namespace)']]], + ['neg_153',['NEG',['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba8382530f5229c7220c0b0f2628334019',1,'cv::datasets::NEG'],['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba8382530f5229c7220c0b0f2628334019',1,'NEG(Global Namespace)']]], + ['neg_154',['neg',['https://docs.opencv.org/4.2.0/d4/d6a/structcv_1_1optflow_1_1GPCPatchSample.html#ac349003c6aeac96618e985202601e078',1,'cv::optflow::GPCPatchSample']]], ['neg_5fformat_155',['neg_format',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#aad6cb2a546002bb6c2618d8531da0ede',1,'std::moneypunct::neg_format() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#aad6cb2a546002bb6c2618d8531da0ede',1,'std::moneypunct::neg_format() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#aad6cb2a546002bb6c2618d8531da0ede',1,'std::moneypunct_byname::neg_format() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#aad6cb2a546002bb6c2618d8531da0ede',1,'std::moneypunct_byname::neg_format() const']]], ['negate_156',['negate',['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1negate.html',1,'cv::cudev::negate< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07375.html',1,'std::negate< class >']]], ['negate_3c_20void_20_3e_157',['negate< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07399.html',1,'std']]], @@ -219,8 +219,8 @@ var searchData= ['nmsboxes_216',['NMSBoxes',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga9d118d70a1659af729d01b10233213ee',1,'cv::dnn::NMSBoxes(const std::vector< Rect > &bboxes, const std::vector< float > &scores, const float score_threshold, const float nms_threshold, std::vector< int > &indices, const float eta=1.f, const int top_k=0)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga6e9e67e8d1d8b3a70b55ab9ea715e70d',1,'cv::dnn::NMSBoxes(const std::vector< Rect2d > &bboxes, const std::vector< float > &scores, const float score_threshold, const float nms_threshold, std::vector< int > &indices, const float eta=1.f, const int top_k=0)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gaeec27cb32195e71e6d88032bda193162',1,'cv::dnn::NMSBoxes(const std::vector< RotatedRect > &bboxes, const std::vector< float > &scores, const float score_threshold, const float nms_threshold, std::vector< int > &indices, const float eta=1.f, const int top_k=0)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga9d118d70a1659af729d01b10233213ee',1,'NMSBoxes(const std::vector< Rect > &bboxes, const std::vector< float > &scores, const float score_threshold, const float nms_threshold, std::vector< int > &indices, const float eta=1.f, const int top_k=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga6e9e67e8d1d8b3a70b55ab9ea715e70d',1,'NMSBoxes(const std::vector< Rect2d > &bboxes, const std::vector< float > &scores, const float score_threshold, const float nms_threshold, std::vector< int > &indices, const float eta=1.f, const int top_k=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gaeec27cb32195e71e6d88032bda193162',1,'NMSBoxes(const std::vector< RotatedRect > &bboxes, const std::vector< float > &scores, const float score_threshold, const float nms_threshold, std::vector< int > &indices, const float eta=1.f, const int top_k=0)(Global Namespace)']]], ['nn_5findex_2eh_217',['nn_index.h',['https://docs.opencv.org/4.2.0/d6/d9a/nn__index_8h.html',1,'']]], ['nneg_218',['nneg',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a1d846963d82d3506baea457dbeb9dd88',1,'cv::CvFeatureEvaluator']]], - ['no_219',['No',['https://docs.opencv.org/4.2.0/db/d13/structcv_1_1cudev_1_1IsBinaryFunction_1_1No.html',1,'cv::cudev::IsBinaryFunction< class >::No'],['https://docs.opencv.org/4.2.0/dc/d5a/structcv_1_1cudev_1_1IsUnaryFunction_1_1No.html',1,'cv::cudev::IsUnaryFunction< class >::No']]], - ['no_220',['NO',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#af4aa7ccea7ea77db1cead36f46ff6aaface01238585a938d70a28fb4c8b3239a5',1,'cv::detail::Blender::NO'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baa6903ebd9f5e55a2f484a789fce68bf48',1,'cv::detail::ExposureCompensator::NO'],['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html#aa8c4c8cb01e15b4652116630d93c3eb2aea728238e9c14a3c576141bf31b41d77',1,'cv::detail::SeamFinder::NO']]], + ['no_219',['NO',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#af4aa7ccea7ea77db1cead36f46ff6aaface01238585a938d70a28fb4c8b3239a5',1,'cv::detail::Blender::NO'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baa6903ebd9f5e55a2f484a789fce68bf48',1,'cv::detail::ExposureCompensator::NO'],['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html#aa8c4c8cb01e15b4652116630d93c3eb2aea728238e9c14a3c576141bf31b41d77',1,'cv::detail::SeamFinder::NO']]], + ['no_220',['No',['https://docs.opencv.org/4.2.0/db/d13/structcv_1_1cudev_1_1IsBinaryFunction_1_1No.html',1,'cv::cudev::IsBinaryFunction< class >::No'],['https://docs.opencv.org/4.2.0/dc/d5a/structcv_1_1cudev_1_1IsUnaryFunction_1_1No.html',1,'cv::cudev::IsUnaryFunction< class >::No']]], ['no_5fcache_221',['NO_CACHE',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#abd18b22f05533504229e3ee358bb021eab62b5377feeb2e87e51ff999d36d77f2',1,'cv::ocl::Device']]], ['no_5finput_5fscale_222',['NO_INPUT_SCALE',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#afb51e414f22dd69f281a569145ccfad7affd560496866c5b17785b5ac8ba63dc3',1,'cv::ml::ANN_MLP']]], ['no_5flocal_5fmem_223',['NO_LOCAL_MEM',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a863c26836094911821d04c7e105e4733ae7f931fb42966841ccea43ecf3cfe04f',1,'cv::ocl::Device']]], @@ -240,364 +240,362 @@ var searchData= ['noconvergence_237',['NoConvergence',['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea6a68dfb88a8336108a30588bdf356c57',1,'Eigen::NoConvergence'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea6a68dfb88a8336108a30588bdf356c57',1,'NoConvergence(Global Namespace)']]], ['noctavelayers_238',['nOctaveLayers',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a4c84e60f9b1aba425aab45e9cc6f1431',1,'cv::cuda::SURF_CUDA']]], ['noctaves_239',['nOctaves',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a198872f947db4614cc7a377d61a15272',1,'cv::cuda::SURF_CUDA']]], - ['node_240',['Node',['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html',1,'cv::ml::DTrees::Node'],['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html',1,'cv::Node< OBJECT >'],['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html',1,'cv::optflow::GPCTree::Node'],['https://docs.opencv.org/4.2.0/d9/de0/structcv_1_1SparseMat_1_1Node.html',1,'cv::SparseMat::Node']]], + ['node_240',['Node',['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html',1,'cv::ml::DTrees::Node'],['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html',1,'cv::Node< OBJECT >'],['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html',1,'cv::optflow::GPCTree::Node'],['https://docs.opencv.org/4.2.0/d9/de0/structcv_1_1SparseMat_1_1Node.html',1,'cv::SparseMat::Node'],['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#a8ccfac7b20d1d2e0aa064932266fda12',1,'cv::Node::Node()'],['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#a1a1cc0c6aeeae4bed3f94013ef9320ff',1,'cv::Node::Node(OBJECT &payload)'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#aa89eb58fece3c80a3821bf7b227e24d9',1,'cv::ml::DTrees::Node::Node()']]], ['node_241',['node',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a499f156a1dc912aae86f1d725fbb9b77',1,'cv::SparseMat::node(size_t nidx)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ab3e934620dcbc6248a09e2b8a5760b3f',1,'cv::SparseMat::node(size_t nidx) const'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a7ed9e9598e8d21f6dc2d05b0bba0a544',1,'cv::SparseMatConstIterator::node()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a25c6cb8b64be6740da109cffe8667bd8',1,'cv::SparseMatIterator::node()']]], - ['node_242',['Node',['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#a8ccfac7b20d1d2e0aa064932266fda12',1,'cv::Node::Node()'],['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#a1a1cc0c6aeeae4bed3f94013ef9320ff',1,'cv::Node::Node(OBJECT &payload)'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#aa89eb58fece3c80a3821bf7b227e24d9',1,'cv::ml::DTrees::Node::Node()']]], - ['node_20js_243',['Using OpenCV.js In Node.js',['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'']]], - ['node_5fbegin_244',['node_begin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html#aca223c3ee20287cd81e0a2531f6c1ae9',1,'__gnu_pbds::detail::ov_tree_map::node_begin() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html#a0219630894698aa4bab588b80ff4ebce',1,'__gnu_pbds::detail::ov_tree_map::node_begin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html#a838ce48eabe1bc0e39ab30be4db3871d',1,'__gnu_pbds::detail::pat_trie_map::node_begin() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html#ac9b60cb2ae918dc8d324525d78a4f470',1,'__gnu_pbds::detail::pat_trie_map::node_begin()']]], - ['node_5fconst_5fiterator_245',['node_const_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'__gnu_pbds::detail::bin_search_tree_traits::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11647.html#a7956a5cdcec778e8abce36c69ccd3053',1,'__gnu_pbds::detail::bin_search_tree_traits< Key, null_type, Cmp_Fn, Node_Update, Node, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11879.html#aa623b4dd1c1f576ef1ad3f8643d2d24a',1,'__gnu_pbds::detail::tree_traits< Key, Mapped, Cmp_Fn, Node_Update, ov_tree_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'__gnu_pbds::detail::tree_traits< Key, Mapped, Cmp_Fn, Node_Update, rb_tree_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'__gnu_pbds::detail::tree_traits< Key, Mapped, Cmp_Fn, Node_Update, splay_tree_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11883.html#a37ce1fb575484aa3bcab916f9d2f5586',1,'__gnu_pbds::detail::tree_traits< Key, null_type, Cmp_Fn, Node_Update, ov_tree_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'__gnu_pbds::detail::tree_traits< Key, null_type, Cmp_Fn, Node_Update, rb_tree_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'__gnu_pbds::detail::tree_traits< Key, null_type, Cmp_Fn, Node_Update, splay_tree_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11959.html#a52596c1faa5ae4c55f2cbb7872c0e478',1,'__gnu_pbds::detail::trie_traits< Key, Mapped, _ATraits, Node_Update, pat_trie_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11963.html#a6b9b24aec02d5b81b47bdad843750d4f',1,'__gnu_pbds::detail::trie_traits< Key, null_type, _ATraits, Node_Update, pat_trie_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'bin_search_tree_traits< Key, Mapped, Cmp_Fn, Node_Update, rb_tree_node_< types_traits< Key, Mapped, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, Mapped, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'bin_search_tree_traits< Key, Mapped, Cmp_Fn, Node_Update, splay_tree_node_< types_traits< Key, Mapped, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, Mapped, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'bin_search_tree_traits< Key, null_type, Cmp_Fn, Node_Update, rb_tree_node_< types_traits< Key, null_type, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, null_type, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'bin_search_tree_traits< Key, null_type, Cmp_Fn, Node_Update, splay_tree_node_< types_traits< Key, null_type, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, null_type, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >::node_const_iterator']]], - ['node_5fend_246',['node_end',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html#a8e887ff6a27b34396414744b4dda3e29',1,'__gnu_pbds::detail::ov_tree_map::node_end() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html#a3201dc70375ce5c9646bf82e2dfaf110',1,'__gnu_pbds::detail::ov_tree_map::node_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html#ac7bae9afb7a1120013b017cf52409090',1,'__gnu_pbds::detail::pat_trie_map::node_end() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html#ad8f66bcf85fce7c72b57f9f050a302d7',1,'__gnu_pbds::detail::pat_trie_map::node_end()']]], - ['node_5fhandle_2eh_247',['node_handle.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00431.html',1,'']]], - ['node_5ftype_248',['node_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11903.html#a3df5e43907830910e3ce34d411088940',1,'__gnu_pbds::detail::pat_trie_base::node_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11903.html#a3df5e43907830910e3ce34d411088940',1,'__gnu_pbds::detail::pat_trie_map::node_type']]], - ['node_5fupdate_249',['node_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11959.html#a1d89507b401632d21a8afa5f8475db88',1,'__gnu_pbds::detail::trie_traits< Key, Mapped, _ATraits, Node_Update, pat_trie_tag, _Alloc >::node_update'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11963.html#a19326cc52a16fcfc9afe45cdfbb100bd',1,'__gnu_pbds::detail::trie_traits< Key, null_type, _ATraits, Node_Update, pat_trie_tag, _Alloc >::node_update']]], - ['nodecount_250',['nodeCount',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#af85adc1b8ca1660afcf00f8df02e532e',1,'cv::SparseMat::Hdr']]], - ['nodedata_251',['NodeData',['https://docs.opencv.org/4.2.0/d7/dc2/classcv_1_1instr_1_1NodeData.html',1,'cv::instr::NodeData'],['https://docs.opencv.org/4.2.0/d7/dc2/classcv_1_1instr_1_1NodeData.html#a641519557ec9bf51ad37ed4145cf7fef',1,'cv::instr::NodeData::NodeData(const char *funName=0, const char *fileName=NULL, int lineNum=0, void *retAddress=NULL, bool alwaysExpand=false, cv::instr::TYPE instrType=TYPE_GENERAL, cv::instr::IMPL implType=IMPL_PLAIN)'],['https://docs.opencv.org/4.2.0/d7/dc2/classcv_1_1instr_1_1NodeData.html#a6cf6fb25e7041e77c0e3d6374172baee',1,'cv::instr::NodeData::NodeData(NodeData &ref)']]], - ['nodedatatls_252',['NodeDataTls',['https://docs.opencv.org/4.2.0/da/df1/structcv_1_1instr_1_1NodeDataTls.html',1,'cv::instr::NodeDataTls'],['https://docs.opencv.org/4.2.0/da/df1/structcv_1_1instr_1_1NodeDataTls.html#a34016bdad236c128476f65d6e591fee2',1,'cv::instr::NodeDataTls::NodeDataTls()']]], - ['nodenelems_253',['nodeNElems',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a6f58d984f262f8ba6d49bec26b44a1ba',1,'cv::FileNodeIterator']]], - ['nodes_254',['nodes',['https://docs.opencv.org/4.2.0/d9/d8b/structhashtable__int.html#a95f66a365503d1e45ac4c90b7eca3673',1,'hashtable_int']]], - ['nodesize_255',['nodeSize',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#a7c640b50e79d174311bd058247a9f8e9',1,'cv::SparseMat::Hdr']]], - ['noexposurecompensator_256',['NoExposureCompensator',['https://docs.opencv.org/4.2.0/d2/dc1/classcv_1_1detail_1_1NoExposureCompensator.html',1,'cv::detail']]], - ['noise_20removing_20filter_257',['Periodic Noise Removing Filter',['https://docs.opencv.org/4.2.0/d2/d0b/tutorial_periodic_noise_removing_filter.html',1,'']]], - ['noisecovmat_258',['NoiseCovMat',['../classfilters_1_1statespace_1_1NoiseCovMat.html',1,'filters::statespace::NoiseCovMat< stateDim, size, paramSize >'],['../classfilters_1_1statespace_1_1NoiseCovMat.html#aca71d2b7eb001db879fbf7cd34b0d4d9',1,'filters::statespace::NoiseCovMat::NoiseCovMat(const Eigen::Matrix< double, size, 1 > &stdDevs)'],['../classfilters_1_1statespace_1_1NoiseCovMat.html#adab6097e466318ffbd2e18f4a0ead5e6',1,'filters::statespace::NoiseCovMat::NoiseCovMat(const Eigen::Matrix< double, size, size > &mat)'],['../classfilters_1_1statespace_1_1NoiseCovMat.html#a797787239ab515bfea3be8e68c543e59',1,'filters::statespace::NoiseCovMat::NoiseCovMat(const std::function< Eigen::Matrix< double, size, size >(const state_t &, const param_t &)> &func)'],['../classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4.html#a3443d32b2982b2a713ba146e0ec0e999',1,'filters::statespace::NoiseCovMat<-1, -1, -1 >::NoiseCovMat(const Eigen::VectorXd &stdDevs, int stateDim, int paramSize)'],['../classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4.html#a3ce04ea741d308fd9b395243a1d3e929',1,'filters::statespace::NoiseCovMat<-1, -1, -1 >::NoiseCovMat(const Eigen::MatrixXd &mat, int stateDim, int paramSize)'],['../classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4.html#a5321f825bad289c3cb3983d3b840cc2e',1,'filters::statespace::NoiseCovMat<-1, -1, -1 >::NoiseCovMat(const std::function< Eigen::MatrixXd(const Eigen::VectorXd &, const Eigen::VectorXd &)> &func, int stateDim, int size, int paramSize)']]], - ['noisecovmat_3c_20statedim_2c_20outputnoisedim_2c_20outputdim_20_3e_259',['NoiseCovMat< stateDim, outputNoiseDim, outputDim >',['../classfilters_1_1statespace_1_1NoiseCovMat.html',1,'filters::statespace']]], - ['noisecovmat_3c_20statedim_2c_20processnoisedim_2c_20inputdim_20_3e_260',['NoiseCovMat< stateDim, processNoiseDim, inputDim >',['../classfilters_1_1statespace_1_1NoiseCovMat.html',1,'filters::statespace']]], - ['noisecovmat_3c_2d1_2c_20_2d1_2c_20_2d1_20_3e_261',['NoiseCovMat<-1, -1, -1 >',['../classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4.html',1,'filters::statespace']]], - ['non_20free_202d_20features_20algorithms_262',['Non-free 2D Features Algorithms',['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html',1,'']]], - ['non_20linearly_20separable_20data_263',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], - ['non_20mutating_264',['Non-Mutating',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html',1,'']]], - ['non_20photorealistic_20rendering_265',['Non-Photorealistic Rendering',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html',1,'']]], - ['non_5fconst_5ftype_266',['non_const_type',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#ad49fd7ff0530be35d0a886df6afbff7d',1,'cv::cudev::TypeTraits']]], - ['non_5flinear_5fsvms_2emarkdown_267',['non_linear_svms.markdown',['https://docs.opencv.org/4.2.0/da/d42/non__linear__svms_8markdown.html',1,'']]], - ['non_5fmaximal_5fsuppression_268',['non_maximal_suppression',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a4b23cd5f68da58fae6bf70748dab2cef',1,'cv::dnn_objdetect::InferBbox']]], - ['non_5fvolatile_5ftype_269',['non_volatile_type',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a36525ea76a28e65537dd5da81b52651a',1,'cv::cudev::TypeTraits']]], - ['none_270',['none',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a70bef0686be2c1b746e21069f73415b8',1,'std::locale::none'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a55acf106c98106e68dfb1e475176624b',1,'std::bitset::none()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a5399d063c80e2837bda0ff98a8435e50',1,'std::tr2::dynamic_bitset::none()']]], - ['none_271',['NONE',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba7f22b71cc694233d39d400bb0192a30a',1,'cv::_InputArray::NONE'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a1ffa1550fdf90e132df54bf982e694cd',1,'cv::FileNode::NONE'],['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#aaee8f2a3f0f04415acca5f1ada1ce8eda9eef92f7409954282a9692e42a86a5cc',1,'cv::viz::KeyboardEvent::NONE'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1838399ee67c0957c0ae42cabfa99033aa3aa1dfcdc14255c12d84f9a932493b9',1,'cv::ogl::Texture2D::NONE']]], - ['none_272',['none',['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html#gga3bdb11e4d5333d49ecab1e789fcce58eac10123dfa7c5e5311f56bea9cfbfe795',1,'cv::datasets::none'],['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html#gga3bdb11e4d5333d49ecab1e789fcce58eac10123dfa7c5e5311f56bea9cfbfe795',1,'none(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a334c4a4c42fdb79d7ebc3e73b517e6f8',1,'none(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a334c4a4c42fdb79d7ebc3e73b517e6f8',1,'none(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a334c4a4c42fdb79d7ebc3e73b517e6f8',1,'none(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a334c4a4c42fdb79d7ebc3e73b517e6f8',1,'none(Global Namespace)']]], - ['none_5fof_273',['none_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga245f9003d26e4ca6c9b304c4cca2c77f',1,'std::none_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga245f9003d26e4ca6c9b304c4cca2c77f',1,'none_of(_InputIterator __first, _InputIterator __last, _Predicate __pred)(Global Namespace)']]], - ['nonfree_2ehpp_274',['nonfree.hpp',['https://docs.opencv.org/4.2.0/dc/dcb/nonfree_8hpp.html',1,'']]], - ['nonlocalmeans_275',['nonLocalMeans',['https://docs.opencv.org/4.2.0/d1/d79/group__photo__denoise.html#gafa990f16548581987e7e509b435c3648',1,'cv::cuda::nonLocalMeans()'],['https://docs.opencv.org/4.2.0/d1/d79/group__photo__denoise.html#gafa990f16548581987e7e509b435c3648',1,'nonLocalMeans()(Global Namespace)']]], - ['nonmax_5fsuppression_276',['NONMAX_SUPPRESSION',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#aeb231abf4b24747a3e2f6ca4d99132caa2fb1b00216bfc495c99346bc8c11d328',1,'cv::AgastFeatureDetector::NONMAX_SUPPRESSION'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#aadc316b5df92d9e457c9c984f1bab7eea481d00b76bfc41ad8a6dabb17bb9abe0',1,'cv::FastFeatureDetector::NONMAX_SUPPRESSION']]], - ['nonzeropivots_277',['nonzeroPivots',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a796610bab81f0527aa1ae440c71f58a4',1,'Eigen::ColPivHouseholderQR::nonzeroPivots()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a796610bab81f0527aa1ae440c71f58a4',1,'ColPivHouseholderQR< MatrixType >::nonzeroPivots()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#af9d7a5bdbc16a4a0bf7394ef0dd208da',1,'Eigen::CompleteOrthogonalDecomposition::nonzeroPivots()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#af1e4d04824084a964c1a6e51db68376f',1,'Eigen::FullPivHouseholderQR::nonzeroPivots()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#aa71132a751ad3c78178e33d6b2987400',1,'Eigen::FullPivLU::nonzeroPivots()']]], - ['nonzeros_278',['nonZeros',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#acb8d5574eff335381e7441ade87700a0',1,'Eigen::DenseBase::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#acb8d5574eff335381e7441ade87700a0',1,'DenseBase< ArrayWrapper< ExpressionType > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#acb8d5574eff335381e7441ade87700a0',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#acb8d5574eff335381e7441ade87700a0',1,'DenseBase< Solve< Decomposition, RhsType > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'Eigen::SparseCompressedBase::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< Derived >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< Transpose< MatrixType > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a753e975b7b3643d821dc061141786870',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae53743108cd668b8da927ff149631fe0',1,'Eigen::SparseMatrix::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae53743108cd668b8da927ff149631fe0',1,'SparseMatrix< Scalar >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae53743108cd668b8da927ff149631fe0',1,'SparseMatrix< Scalar, ColMajor, int >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae53743108cd668b8da927ff149631fe0',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae53743108cd668b8da927ff149631fe0',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#a6c211a24bcd0af8a4e241c4704abffe0',1,'Eigen::SparseVector::nonZeros()']]], - ['nonzerosingularvalues_279',['nonzeroSingularValues',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#afe8a555f38393a319a71ec0f0331c9ef',1,'Eigen::SVDBase::nonzeroSingularValues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#afe8a555f38393a319a71ec0f0331c9ef',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::nonzeroSingularValues()']]], - ['nopreferredstorageorderbit_280',['NoPreferredStorageOrderBit',['https://eigen.tuxfamily.org/dox/group__flags.html#ga3c186ad80ddcf5e2ed3d7ee31cca1860',1,'Eigen::NoPreferredStorageOrderBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#ga3c186ad80ddcf5e2ed3d7ee31cca1860',1,'NoPreferredStorageOrderBit(Global Namespace)']]], - ['noqrpreconditioner_281',['NoQRPreconditioner',['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56ea2e95bc818f975b19def01e93d240dece',1,'Eigen::NoQRPreconditioner'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56ea2e95bc818f975b19def01e93d240dece',1,'NoQRPreconditioner(Global Namespace)']]], - ['norm_282',['norm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a196c4ec3c8ffdf5bda45d0f617154975',1,'Eigen::MatrixBase::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a196c4ec3c8ffdf5bda45d0f617154975',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a196c4ec3c8ffdf5bda45d0f617154975',1,'MatrixBase< Solve< Decomposition, RhsType > >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aad4b1faef1eabdc7fdd4d305e9881149',1,'Eigen::QuaternionBase::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aad4b1faef1eabdc7fdd4d305e9881149',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aad4b1faef1eabdc7fdd4d305e9881149',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aad4b1faef1eabdc7fdd4d305e9881149',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'Eigen::VectorwiseOp::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const Derived, Horizontal >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const Derived, Vertical >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::norm()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga4e556cb8ad35a643a1ea66e035711bb9',1,'cv::norm(const Matx< _Tp, m, n > &M)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7199682a392fe6788e4edc4eeb5a4b65',1,'cv::norm(const Matx< _Tp, m, n > &M, int normType)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga55a581f0accd8d990af775d378e7e46c',1,'cv::norm(InputArray src1, int normType=NORM_L2, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gae15fc2d956eb3a93ec65339a50dc7b6a',1,'cv::norm(InputArray src1, InputArray src2, int normType=NORM_L2, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7c331fb8dd951707e184ef4e3f21dd33',1,'cv::norm(const SparseMat &src, int normType)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga6c01988a58d92126a7c60a4ab76d8324',1,'cv::cuda::norm(InputArray src1, int normType, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga48b6298589b80a6915d076e2dcdbd11b',1,'cv::cuda::norm(InputArray src1, InputArray src2, int normType=NORM_L2)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga4e556cb8ad35a643a1ea66e035711bb9',1,'norm(const Matx< _Tp, m, n > &M)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7199682a392fe6788e4edc4eeb5a4b65',1,'norm(const Matx< _Tp, m, n > &M, int normType)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga55a581f0accd8d990af775d378e7e46c',1,'norm(InputArray src1, int normType=NORM_L2, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gae15fc2d956eb3a93ec65339a50dc7b6a',1,'norm(InputArray src1, InputArray src2, int normType=NORM_L2, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7c331fb8dd951707e184ef4e3f21dd33',1,'norm(const SparseMat &src, int normType)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga6c01988a58d92126a7c60a4ab76d8324',1,'norm(InputArray src1, int normType, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga48b6298589b80a6915d076e2dcdbd11b',1,'norm(InputArray src1, InputArray src2, int normType=NORM_L2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga18ce7540f44fe30715fca0cdb37c9241',1,'std::norm()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga18ce7540f44fe30715fca0cdb37c9241',1,'norm()(Global Namespace)']]], - ['norm_5fhamming_283',['NORM_HAMMING',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa4b063afd04aebb8dd07085a1207da727',1,'cv::NORM_HAMMING'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa4b063afd04aebb8dd07085a1207da727',1,'NORM_HAMMING(Global Namespace)']]], - ['norm_5fhamming2_284',['NORM_HAMMING2',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7fab9cda83e79380cd273c49de8e3231',1,'cv::NORM_HAMMING2'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7fab9cda83e79380cd273c49de8e3231',1,'NORM_HAMMING2(Global Namespace)']]], - ['norm_5finf_285',['NORM_INF',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fad33872d928c74f8a49d1ba06d72aefc3',1,'cv::NORM_INF'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fad33872d928c74f8a49d1ba06d72aefc3',1,'NORM_INF(Global Namespace)']]], - ['norm_5fl1_286',['NORM_L1',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fab55c78ff204a979026c026ea19de65c9',1,'cv::NORM_L1'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fab55c78ff204a979026c026ea19de65c9',1,'NORM_L1(Global Namespace)']]], - ['norm_5fl2_287',['NORM_L2',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7bacbe84d400336a8f26297d8e80e3a2',1,'cv::NORM_L2'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7bacbe84d400336a8f26297d8e80e3a2',1,'NORM_L2(Global Namespace)']]], - ['norm_5fl2sqr_288',['NORM_L2SQR',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fabe948af03c9289b0dd7e663d5c035f5a',1,'cv::NORM_L2SQR'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fabe948af03c9289b0dd7e663d5c035f5a',1,'NORM_L2SQR(Global Namespace)']]], - ['norm_5fminmax_289',['NORM_MINMAX',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa9f0c1c342a18114d47b516a88e29822e',1,'cv::NORM_MINMAX'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa9f0c1c342a18114d47b516a88e29822e',1,'NORM_MINMAX(Global Namespace)']]], - ['norm_5frelative_290',['NORM_RELATIVE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa0a85f9203dcdf3fbc1cca589b6f5df39',1,'cv::NORM_RELATIVE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa0a85f9203dcdf3fbc1cca589b6f5df39',1,'NORM_RELATIVE(Global Namespace)']]], - ['norm_5ftype_5fmask_291',['NORM_TYPE_MASK',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149faaabf1ea549554e2cbdfde2acfcfc5374',1,'cv::NORM_TYPE_MASK'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149faaabf1ea549554e2cbdfde2acfcfc5374',1,'NORM_TYPE_MASK(Global Namespace)']]], - ['normal_292',['normal',['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a567f2d13d5c9835f2884c329185e4c63',1,'Eigen::Hyperplane::normal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#abe6786725d6aae2e6ef6981395aeac46',1,'Eigen::Hyperplane::normal() const']]], - ['normal_293',['NORMAL',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#aa2a27f17a1a30fad4c54c248b77777e0af115eca6e3361cd5ec6cb1887f0aabd3',1,'cv::xfeatures2d::PCTSignatures::NORMAL'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#ae0feca638ad1b7a6656794871700d8d1a85da6d7bc413e10a648f638151129a91',1,'cv::RNG::NORMAL']]], - ['normal_20distributions_294',['Normal Distributions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html',1,'']]], - ['normal_5fclone_295',['NORMAL_CLONE',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca8e6473804ceaa0e8bd0e5828a05235a7',1,'cv::NORMAL_CLONE'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca8e6473804ceaa0e8bd0e5828a05235a7',1,'NORMAL_CLONE(Global Namespace)']]], - ['normal_5fdistribution_296',['normal_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html',1,'std::normal_distribution< _RealType >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae3d912adf379592d4b7fdd7557312bcf',1,'normal_distribution< double >::normal_distribution()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae3d912adf379592d4b7fdd7557312bcf',1,'normal_distribution< result_type >::normal_distribution()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae3d912adf379592d4b7fdd7557312bcf',1,'std::normal_distribution::normal_distribution()']]], - ['normal_5fdistribution_3c_20double_20_3e_297',['normal_distribution< double >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html',1,'']]], - ['normal_5fdistribution_3c_20result_5ftype_20_3e_298',['normal_distribution< result_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html',1,'']]], - ['normalbayesclassifier_299',['NormalBayesClassifier',['https://docs.opencv.org/4.2.0/d4/d8e/classcv_1_1ml_1_1NormalBayesClassifier.html',1,'cv::ml']]], - ['normaliseoutput_300',['normaliseOutput',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a4396c41915e446d630378aa4bb34a38b',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters::normaliseOutput'],['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#a88025fa1e453fb0262818c638742ff37',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters::normaliseOutput']]], - ['normalizationtype_301',['NormalizationType',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151',1,'cv::xfeatures2d::DAISY']]], - ['normalize_302',['normalize',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#aefc01541eeaf8063f6d2f19cc46fe0e0',1,'cv::reg::MapProjec::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ae090309b1a932e07a983ff7dd84a3120',1,'Eigen::Hyperplane::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad16303c47ba36f7a41ea264cb26bceb6',1,'Eigen::MatrixBase::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad16303c47ba36f7a41ea264cb26bceb6',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad16303c47ba36f7a41ea264cb26bceb6',1,'MatrixBase< Solve< Decomposition, RhsType > >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7a487a8a129b46be562f42044102c1f8',1,'Eigen::QuaternionBase::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7a487a8a129b46be562f42044102c1f8',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7a487a8a129b46be562f42044102c1f8',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7a487a8a129b46be562f42044102c1f8',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'Eigen::VectorwiseOp::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const Derived, Horizontal >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const Derived, Vertical >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::normalize()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1b6a396a456c8b6c6e4afd8591560d80',1,'cv::normalize(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga87eef7ee3970f86906d69a92cbf064bd',1,'cv::normalize(InputArray src, InputOutputArray dst, double alpha=1, double beta=0, int norm_type=NORM_L2, int dtype=-1, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7bcf47a1df78cf575162e0aed44960cb',1,'cv::normalize(const SparseMat &src, SparseMat &dst, double alpha, int normType)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga4da4738b9956a5baaa2f5f8c2fba438a',1,'cv::cuda::normalize()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaedda08934a12c8b4d8f3c1762f27cacc',1,'cv::gapi::normalize()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1b6a396a456c8b6c6e4afd8591560d80',1,'normalize(const Vec< _Tp, cn > &v)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga87eef7ee3970f86906d69a92cbf064bd',1,'normalize(InputArray src, InputOutputArray dst, double alpha=1, double beta=0, int norm_type=NORM_L2, int dtype=-1, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7bcf47a1df78cf575162e0aed44960cb',1,'normalize(const SparseMat &src, SparseMat &dst, double alpha, int normType)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaedda08934a12c8b4d8f3c1762f27cacc',1,'normalize(const GMat &src, double alpha, double beta, int norm_type, int ddepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga4da4738b9956a5baaa2f5f8c2fba438a',1,'normalize(InputArray src, OutputArray dst, double alpha, double beta, int norm_type, int dtype, InputArray mask=noArray(), Stream &stream=Stream::Null())(Global Namespace)']]], - ['normalizebboxlayer_303',['NormalizeBBoxLayer',['https://docs.opencv.org/4.2.0/dc/df8/classcv_1_1dnn_1_1NormalizeBBoxLayer.html',1,'cv::dnn']]], - ['normalized_304',['normalized',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5cf2fd4c57e59604fd4116158fd34308',1,'Eigen::MatrixBase::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5cf2fd4c57e59604fd4116158fd34308',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5cf2fd4c57e59604fd4116158fd34308',1,'MatrixBase< Solve< Decomposition, RhsType > >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ade799f18b7ec19c02ddae3a4921fa8a0',1,'Eigen::QuaternionBase::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ade799f18b7ec19c02ddae3a4921fa8a0',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ade799f18b7ec19c02ddae3a4921fa8a0',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ade799f18b7ec19c02ddae3a4921fa8a0',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'Eigen::VectorwiseOp::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const Derived, Horizontal >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const Derived, Vertical >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::normalized()']]], - ['normalizedeightpointsolver_305',['normalizedEightPointSolver',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaa37cc469d0c0573be08c3d55f6f1be8f',1,'cv::sfm::normalizedEightPointSolver()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaa37cc469d0c0573be08c3d55f6f1be8f',1,'normalizedEightPointSolver()(Global Namespace)']]], - ['normalizefundamental_306',['normalizeFundamental',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga99db07182e74de2ecf32d78fe1d5df41',1,'cv::sfm::normalizeFundamental()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga99db07182e74de2ecf32d78fe1d5df41',1,'normalizeFundamental()(Global Namespace)']]], - ['normalizeisotropicpoints_307',['normalizeIsotropicPoints',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga6dd543753e1ef54fe91a4f34e3bcfa81',1,'cv::sfm::normalizeIsotropicPoints()'],['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga6dd543753e1ef54fe91a4f34e3bcfa81',1,'normalizeIsotropicPoints()(Global Namespace)']]], - ['normalizepccoeff_308',['normalizePCCoeff',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaae4792bf8469222356c16364759941aa',1,'cv::ppf_match_3d::normalizePCCoeff()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaae4792bf8469222356c16364759941aa',1,'normalizePCCoeff()(Global Namespace)']]], - ['normalizepoints_309',['normalizePoints',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga2c1df04b9b822fbbb5f3a3c0c1c66ebb',1,'cv::sfm::normalizePoints()'],['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga2c1df04b9b822fbbb5f3a3c0c1c66ebb',1,'normalizePoints()(Global Namespace)']]], - ['normalizeusingweightmap_310',['normalizeUsingWeightMap',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#gad4eab2369179fcb46792aaef2b68425e',1,'cv::detail::normalizeUsingWeightMap()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#gad4eab2369179fcb46792aaef2b68425e',1,'normalizeUsingWeightMap()(Global Namespace)']]], - ['normals_311',['normals',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#afa1bf8f104bc7f0cfefc2bd2e38495f9',1,'cv::viz::Mesh::normals'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#a35770687c412e32902f350d217e94e1b',1,'cv::rgbd::RgbdFrame::normals']]], - ['normalscomputer_312',['normalsComputer',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#ad0363b8e3836257da95f548e26997bb6',1,'cv::rgbd::ICPOdometry::normalsComputer'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a8da046b88ef9b8aaba29827efc40522d',1,'cv::rgbd::RgbdICPOdometry::normalsComputer']]], - ['normbysize_313',['normBySize',['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#acc60d3ba59155867a3f885b0304e8d38',1,'cv::dnn::LRNLayer']]], - ['normconv_5ffilter_314',['NORMCONV_FILTER',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ggaf454b747a111dc9819419b99807ae7acaaab1c1e6dc436a25e1f5506fb6432d4e',1,'cv::NORMCONV_FILTER'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ggaf454b747a111dc9819419b99807ae7acaaab1c1e6dc436a25e1f5506fb6432d4e',1,'NORMCONV_FILTER(Global Namespace)']]], - ['normhamming_315',['NormHamming',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html',1,'cv::cudev::NormHamming'],['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a4c1e14a4da57f206855fefa496f96fa9',1,'cv::cudev::NormHamming::NormHamming()']]], - ['normhamming_316',['normHamming',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf779b175d6b59d5c36b76e58f17cf922',1,'cv::hal::normHamming(const uchar *a, int n)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gadf02bcb9c4a70f4e0f5a3dd66adfd897',1,'cv::hal::normHamming(const uchar *a, const uchar *b, int n)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga51ba95d472f3c7a349b5405e070f595e',1,'cv::hal::normHamming(const uchar *a, int n, int cellSize)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaa671377b42e39aaca23f5ee91f5a8004',1,'cv::hal::normHamming(const uchar *a, const uchar *b, int n, int cellSize)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf779b175d6b59d5c36b76e58f17cf922',1,'normHamming(const uchar *a, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gadf02bcb9c4a70f4e0f5a3dd66adfd897',1,'normHamming(const uchar *a, const uchar *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga51ba95d472f3c7a349b5405e070f595e',1,'normHamming(const uchar *a, int n, int cellSize)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaa671377b42e39aaca23f5ee91f5a8004',1,'normHamming(const uchar *a, const uchar *b, int n, int cellSize)(Global Namespace)']]], - ['normhistogramcostextractor_317',['NormHistogramCostExtractor',['https://docs.opencv.org/4.2.0/df/d65/classcv_1_1NormHistogramCostExtractor.html',1,'cv']]], - ['norminf_318',['normInf',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gafbc6702d6233a210781b69505fe35657',1,'cv::normInf(const _Tp *a, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga88d10ad6fabc12581122af0655f14528',1,'cv::normInf(const _Tp *a, const _Tp *b, int n)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga4d4f56eea9f26736f7d0c703b377f9e7',1,'cv::gapi::normInf()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gafbc6702d6233a210781b69505fe35657',1,'normInf(const _Tp *a, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga88d10ad6fabc12581122af0655f14528',1,'normInf(const _Tp *a, const _Tp *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga4d4f56eea9f26736f7d0c703b377f9e7',1,'normInf(const GMat &src)(Global Namespace)']]], - ['norml1_319',['NormL1',['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html',1,'cv::cudev::NormL1< class >'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#a06f9880799a16f7dc5db55d5d04016f0',1,'cv::cudev::NormL1::NormL1()'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#a4130bce8b8f40743899fc3023f1d6ad9',1,'cv::cudev::NormL1< float >::NormL1()']]], - ['norml1_320',['normL1',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gacb7cee5ed28705cf01ea141ae7927545',1,'cv::normL1(const _Tp *a, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga442c3185940fc1879e26e8676253e0c5',1,'cv::normL1(const _Tp *a, const _Tp *b, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gac43f78105ba75ece4056964547b23c19',1,'cv::normL1(const float *a, const float *b, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae0f0a5246a545bc9aff70680c9efed22',1,'cv::normL1(const uchar *a, const uchar *b, int n)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga238421ed8e075474f03acb06e7168b26',1,'cv::gapi::normL1()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gacb7cee5ed28705cf01ea141ae7927545',1,'normL1(const _Tp *a, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga442c3185940fc1879e26e8676253e0c5',1,'normL1(const _Tp *a, const _Tp *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gac43f78105ba75ece4056964547b23c19',1,'normL1(const float *a, const float *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae0f0a5246a545bc9aff70680c9efed22',1,'normL1(const uchar *a, const uchar *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga238421ed8e075474f03acb06e7168b26',1,'normL1(const GMat &src)(Global Namespace)']]], - ['norml1_3c_20float_20_3e_321',['NormL1< float >',['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html',1,'cv::cudev']]], - ['norml1_5f_322',['normL1_',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacb1b8548f147e1eeda793687beb6bba1',1,'cv::hal::normL1_(const uchar *a, const uchar *b, int n)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga78689e1adfb5b25291dacd03f85fd195',1,'cv::hal::normL1_(const float *a, const float *b, int n)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacb1b8548f147e1eeda793687beb6bba1',1,'normL1_(const uchar *a, const uchar *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga78689e1adfb5b25291dacd03f85fd195',1,'normL1_(const float *a, const float *b, int n)(Global Namespace)']]], - ['norml2_323',['NormL2',['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html',1,'cv::cudev::NormL2'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#a7e597e95eb7dc6bb1d80ac1b5b388239',1,'cv::cudev::NormL2::NormL2()']]], - ['norml2_324',['normL2',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gaeb09f3519bcc89b23ededc3925b9916f',1,'cv::gapi::normL2()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gaeb09f3519bcc89b23ededc3925b9916f',1,'normL2()(Global Namespace)']]], - ['norml2sqr_325',['normL2Sqr',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf0e07145e0927234be3e0311f0658e83',1,'cv::normL2Sqr(const _Tp *a, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae4cfcbe0059f7678012af41dbfcdfbe9',1,'cv::normL2Sqr(const _Tp *a, const _Tp *b, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6a653487f2dc0d579c803be43ddac124',1,'cv::normL2Sqr(const float *a, const float *b, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf0e07145e0927234be3e0311f0658e83',1,'normL2Sqr(const _Tp *a, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae4cfcbe0059f7678012af41dbfcdfbe9',1,'normL2Sqr(const _Tp *a, const _Tp *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6a653487f2dc0d579c803be43ddac124',1,'normL2Sqr(const float *a, const float *b, int n)(Global Namespace)']]], - ['norml2sqr_5f_326',['normL2Sqr_',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3f28624360bc484ef29d8a52f57535e8',1,'cv::hal::normL2Sqr_()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3f28624360bc484ef29d8a52f57535e8',1,'normL2Sqr_()(Global Namespace)']]], - ['normsigma0_327',['normSigma0',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a904e3883188ebdb89beefe6a4a965fa2',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['normsigma1_328',['normSigma1',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#ac4cff7f10381d5bdf53dd4e914850cee',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['normsum_329',['normSum',['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#a056af618dd50c4cf5766fd17b4ac9a47',1,'cv::CvHOGEvaluator']]], - ['normtype_330',['normType',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#a613c8ce6b5f9477398ad901fda9c3976',1,'cv::BFMatcher::normType'],['https://docs.opencv.org/4.2.0/d3/d59/structcv_1_1Hamming.html#af8cc9a994e3652df2cde602e3388fbe2',1,'cv::Hamming::normType'],['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1L1.html#ad89d6306fc5aa869cad4331829a81413',1,'cv::L1::normType'],['https://docs.opencv.org/4.2.0/dc/daa/structcv_1_1L2.html#a8e2183229c487c4bee384b5a013272ee',1,'cv::L2::normType'],['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html#af3f11374d301333b1e0cabf6bdb7a72b',1,'cv::SL2::normType']]], - ['normtypes_331',['NormTypes',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad12cefbcb5291cf958a85b4b67b6149f',1,'cv::NormTypes'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad12cefbcb5291cf958a85b4b67b6149f',1,'NormTypes(Global Namespace)']]], - ['normvariance_332',['normVariance',['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html#a5a238be2bd4942ede8ddd14a31f5fc2f',1,'cv::dnn::MVNLayer']]], - ['noseamfinder_333',['NoSeamFinder',['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1detail_1_1NoSeamFinder.html',1,'cv::detail']]], - ['noshowbase_334',['noshowbase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae40e0e6a5a4292cc070a737693bce4ab',1,'std']]], - ['noshowpoint_335',['noshowpoint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acacc67bedbef4625ffdf88d2b188a9f5',1,'std']]], - ['noshowpos_336',['noshowpos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab7219399afb34c97c7c439be76b2eb49',1,'std']]], - ['noskipws_337',['noskipws',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a371c82c535d8f1e6c245524313394a9a',1,'std']]], - ['nosubs_338',['nosubs',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a29777ae2dd2358f4faf29cb604c3fb85',1,'std::regex_constants']]], - ['not1_339',['not1',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14e6ff9917f324e7bee464664080ff11',1,'cv::cudev::not1()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14e6ff9917f324e7bee464664080ff11',1,'not1()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01509.html#gaa48ba7f453a3e4aec335c304eab89d3b',1,'std::not1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01509.html#gaa48ba7f453a3e4aec335c304eab89d3b',1,'not1()(Global Namespace)']]], - ['not2_340',['not2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabaa3c68534da21be33598016e13ed502',1,'cv::cudev::not2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabaa3c68534da21be33598016e13ed502',1,'not2()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01509.html#ga1244dfac05a74c4665bef243704f51b1',1,'std::not2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01509.html#ga1244dfac05a74c4665bef243704f51b1',1,'not2()(Global Namespace)']]], - ['not8u_341',['not8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabf1778785d2fa6835daa6ef4eec982d6',1,'cv::hal::not8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabf1778785d2fa6835daa6ef4eec982d6',1,'not8u()(Global Namespace)']]], - ['not_5fdraw_5fsingle_5flines_342',['NOT_DRAW_SINGLE_LINES',['https://docs.opencv.org/4.2.0/d8/d6f/structcv_1_1line__descriptor_1_1DrawLinesMatchesFlags.html#af77f9b45585f16821d7a06ea38909e68a5211a6d6db85969c518dedcfd810a901',1,'cv::line_descriptor::DrawLinesMatchesFlags']]], - ['not_5fdraw_5fsingle_5fpoints_343',['NOT_DRAW_SINGLE_POINTS',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a811ff9a659123ff7317ccd1269e59259',1,'NOT_DRAW_SINGLE_POINTS(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a811ff9a659123ff7317ccd1269e59259',1,'NOT_DRAW_SINGLE_POINTS(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a811ff9a659123ff7317ccd1269e59259',1,'NOT_DRAW_SINGLE_POINTS(Global Namespace)']]], - ['not_5fequal_5fto_344',['not_equal_to',['https://docs.opencv.org/4.2.0/df/d9f/structcv_1_1cudev_1_1not__equal__to.html',1,'cv::cudev::not_equal_to< T >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07407.html',1,'std::not_equal_to< class >']]], - ['not_5fequal_5fto_3c_20void_20_3e_345',['not_equal_to< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07447.html',1,'std']]], - ['not_5fset_346',['not_set',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#afa4c5b344cb1b57ccc5c50be8f563071',1,'cv::viz::Color']]], - ['notag_347',['NoTag',['https://docs.opencv.org/4.2.0/db/d4e/structcv_1_1detail_1_1NoTag.html',1,'cv::detail']]], - ['notifiable_348',['Notifiable',['../classutil_1_1impl_1_1Notifiable.html',1,'util::impl']]], - ['notify_349',['notify',['../classutil_1_1AsyncTask.html#aa3410b83c36ea34a1503ff6d61f093d7',1,'util::AsyncTask::notify()'],['../classutil_1_1PeriodicTask.html#ad060d682418dcce364fe2008b662cf2a',1,'util::PeriodicTask::notify()']]], - ['notify_5fcleared_350',['notify_cleared',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#afe7436bbd2219b3bb023834046574805',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_cleared()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11159.html#a4c92b235ca2dcda57fe3d4cee1afb48b',1,'__gnu_pbds::hash_load_check_resize_trigger::notify_cleared()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a05de88b76a627079b289c79e6211b2ff',1,'__gnu_pbds::sample_resize_policy::notify_cleared()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#ad71aeb3fd1e05e60f995c36e3d35767f',1,'__gnu_pbds::sample_resize_trigger::notify_cleared()']]], - ['notify_5ferase_5fsearch_5fcollision_351',['notify_erase_search_collision',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a751447ee7cf5a38825c91c46156f1553',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_erase_search_collision()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a4ffa318ca12b0f6e94025404d719dac6',1,'__gnu_pbds::sample_resize_policy::notify_erase_search_collision()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a088f748acb2a93d3bef0845f30817095',1,'__gnu_pbds::sample_resize_trigger::notify_erase_search_collision()']]], - ['notify_5ferase_5fsearch_5fend_352',['notify_erase_search_end',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#ad2553af559204a400e889dfce3793555',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_erase_search_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a422ecd561446279e732bdd769d0b3e4b',1,'__gnu_pbds::sample_resize_policy::notify_erase_search_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a0d557313c011b673d803dda8053708ef',1,'__gnu_pbds::sample_resize_trigger::notify_erase_search_end()']]], - ['notify_5ferase_5fsearch_5fstart_353',['notify_erase_search_start',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a240b4b28ea1cdc784d5e95c62db3c15f',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_erase_search_start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a5fd680a16511a80b749dd7822fa8f9bc',1,'__gnu_pbds::sample_resize_policy::notify_erase_search_start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a23ea236b72a1cf5c89554f61dcefc3e5',1,'__gnu_pbds::sample_resize_trigger::notify_erase_search_start()']]], - ['notify_5ferased_354',['notify_erased',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a1f46c2c9b293370318f1e2abb64cfcc1',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_erased()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#ab70b8dc8913637ca0f01d35b9773566e',1,'__gnu_pbds::sample_resize_policy::notify_erased()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a7bfcb5953beee28b074a8226acad55d5',1,'__gnu_pbds::sample_resize_trigger::notify_erased()']]], - ['notify_5fexternally_5fresized_355',['notify_externally_resized',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a548dc80e54ce98dfb63b6197b0a5367f',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_externally_resized()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#af2b8a2fbe273f91aaf149eaedecd56de',1,'__gnu_pbds::sample_resize_trigger::notify_externally_resized()']]], - ['notify_5ffind_5fsearch_5fcollision_356',['notify_find_search_collision',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#aa657361a797637c5894f887b2f68b08d',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_find_search_collision()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a5a06ce787b7413b6acb303828152ae7c',1,'__gnu_pbds::sample_resize_policy::notify_find_search_collision()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a9c0b640580ae2e181daabbf9957da8e7',1,'__gnu_pbds::sample_resize_trigger::notify_find_search_collision()']]], - ['notify_5ffind_5fsearch_5fend_357',['notify_find_search_end',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a495e2209b7f02d5006404aaaa1087768',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_find_search_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a835318af4e9e95601fc28a30c6bafa48',1,'__gnu_pbds::sample_resize_policy::notify_find_search_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#af0e3483a3dcb16e0be3f94f0affb2056',1,'__gnu_pbds::sample_resize_trigger::notify_find_search_end()']]], - ['notify_5ffind_5fsearch_5fstart_358',['notify_find_search_start',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#aecfd626845c5f41b5996a98ce41abe5d',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_find_search_start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a049a9b26e770f5856ba47127603952bf',1,'__gnu_pbds::sample_resize_policy::notify_find_search_start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#af384d9703a5ed2c0e7d2bc70889f659f',1,'__gnu_pbds::sample_resize_trigger::notify_find_search_start()']]], - ['notify_5finsert_5fsearch_5fcollision_359',['notify_insert_search_collision',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a0ada2bfdc28eb5b321d4e40ae1d383f1',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_insert_search_collision()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#aca8c593c0e90ebd7e9e76507f2a66681',1,'__gnu_pbds::sample_resize_policy::notify_insert_search_collision()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a2abd2edcc33007cf820628cb17fe98cb',1,'__gnu_pbds::sample_resize_trigger::notify_insert_search_collision()']]], - ['notify_5finsert_5fsearch_5fend_360',['notify_insert_search_end',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a64694cff7ecc080077cf5a1d77cfb91f',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_insert_search_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a324ce12091c2c37a6b0e8157b76ab63b',1,'__gnu_pbds::sample_resize_policy::notify_insert_search_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a126cd2bc9ea39c89a5dee38f9eaf5c38',1,'__gnu_pbds::sample_resize_trigger::notify_insert_search_end()']]], - ['notify_5finsert_5fsearch_5fstart_361',['notify_insert_search_start',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#ac180a1382d59cb873053ef1a00aeaf7a',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_insert_search_start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#af97f835b6224de469cefcf56c56af820',1,'__gnu_pbds::sample_resize_policy::notify_insert_search_start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a0f332904f1c430cb8a914b50cb1ec6c8',1,'__gnu_pbds::sample_resize_trigger::notify_insert_search_start()']]], - ['notify_5finserted_362',['notify_inserted',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a3873f31f2d3d3ff8118f48fa2bead1a8',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_inserted()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11159.html#a6389dcb57ad2dc82804a7dbf32d96fc8',1,'__gnu_pbds::hash_load_check_resize_trigger::notify_inserted()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#ad86ab0f36470d704ca8641b07717c1c7',1,'__gnu_pbds::sample_resize_policy::notify_inserted()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#af820554398c7ec86b22255c89e6aadfa',1,'__gnu_pbds::sample_resize_trigger::notify_inserted()']]], - ['notify_5fresized_363',['notify_resized',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a21c9dcb73448b7a0e82857a272ad43a8',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_resized()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11159.html#a027d59f653ccc3272bb94540164bfd77',1,'__gnu_pbds::hash_load_check_resize_trigger::notify_resized()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11787.html#a1394c13061424917235d675059ae554e',1,'__gnu_pbds::sample_range_hashing::notify_resized()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11791.html#a60cf8f7475787a8828380db05189e452',1,'__gnu_pbds::sample_ranged_hash_fn::notify_resized()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a1f8207b058608607c137773eef92679c',1,'__gnu_pbds::sample_resize_policy::notify_resized()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a21662c6d33a62336b1ed122cf717ff00',1,'__gnu_pbds::sample_resize_trigger::notify_resized()']]], - ['nounitbuf_364',['nounitbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a205c934d476ce13b62c74c1e1229e906',1,'std']]], - ['nouppercase_365',['nouppercase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0b1c781ecc10f910c74dd2ff27a1f2ae',1,'std']]], - ['nplanes_366',['nplanes',['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a94ba374a7e5a004d19060a522893e09d',1,'cv::NAryMatIterator']]], - ['npos_367',['npos',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a73ccdcfb7ba35398105c667960f1f9f8',1,'cv::CvFeatureEvaluator::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a8ae69d8d271de80c7989283cd34a1790',1,'__gnu_cxx::__versa_string::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'__gnu_debug::basic_string::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< _CharT >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< _CharT, _Traits, _Allocator >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< char >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< char, char_traits< char >, _Byte_alloc >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< char_type, _Traits, _Alloc >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< value_type >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'std::basic_string::npos']]], - ['npp_5fstaging_2ehpp_368',['NPP_staging.hpp',['https://docs.opencv.org/4.2.0/d5/d2c/NPP__staging_8hpp.html',1,'']]], - ['nppistdecimate_5f32f_5fc1r_369',['nppiStDecimate_32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga41653691e02f61bac1555628df1c9176',1,]]], - ['nppistdecimate_5f32f_5fc1r_5fhost_370',['nppiStDecimate_32f_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga4c06da37459c05da8c746a116c6b8a26',1,]]], - ['nppistdecimate_5f32s_5fc1r_371',['nppiStDecimate_32s_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga2f264c45b0a58ba1914d4da7f2d42729',1,]]], - ['nppistdecimate_5f32s_5fc1r_5fhost_372',['nppiStDecimate_32s_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga390d9ae987ab8986a476df3b2a6e563d',1,]]], - ['nppistdecimate_5f32u_5fc1r_373',['nppiStDecimate_32u_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gaf180ff84ab050091645b9747e059f582',1,]]], - ['nppistdecimate_5f32u_5fc1r_5fhost_374',['nppiStDecimate_32u_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga9e6782d12f3d60eb841b48d4f351eb0c',1,]]], - ['nppistdecimate_5f64f_5fc1r_375',['nppiStDecimate_64f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gaba8ac56503435b723a35cb541b4af2d8',1,]]], - ['nppistdecimate_5f64f_5fc1r_5fhost_376',['nppiStDecimate_64f_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga99f7ba921a703545275da77c60b9dcfa',1,]]], - ['nppistdecimate_5f64s_5fc1r_377',['nppiStDecimate_64s_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gaf107bae80aa121b57664057951f56155',1,]]], - ['nppistdecimate_5f64s_5fc1r_5fhost_378',['nppiStDecimate_64s_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga292a3b4a145ee6c7f4f0f995d42d09e9',1,]]], - ['nppistdecimate_5f64u_5fc1r_379',['nppiStDecimate_64u_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga02d494bfc76b4327fb6a730525a4ee7a',1,]]], - ['nppistdecimate_5f64u_5fc1r_5fhost_380',['nppiStDecimate_64u_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga6aebe497ce42cce998d6dfe02981a374',1,]]], - ['nppistfiltercolumnborder_5f32f_5fc1r_381',['nppiStFilterColumnBorder_32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga2fe3ed7981d4245d0bd7f63e94234948',1,]]], - ['nppistfilterrowborder_5f32f_5fc1r_382',['nppiStFilterRowBorder_32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga54f143dc33abad123cb6b14041f7cda5',1,]]], - ['nppistgetinterpolationbuffersize_383',['nppiStGetInterpolationBufferSize',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga105e268f9e92bf2795102720a2d03082',1,]]], - ['nppistintegral_5f32f32f_5fc1r_384',['nppiStIntegral_32f32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gad651eea1a106e926b46d9a578f982bd2',1,]]], - ['nppistintegral_5f32f32f_5fc1r_5fhost_385',['nppiStIntegral_32f32f_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gab4c8b8ff1c5ddac07b13250affde330c',1,]]], - ['nppistintegral_5f8u32u_5fc1r_386',['nppiStIntegral_8u32u_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga8d9fe449c1caacf9875c41d49dc864ec',1,]]], - ['nppistintegral_5f8u32u_5fc1r_5fhost_387',['nppiStIntegral_8u32u_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga4d98e56ebd905bd60210e1f26a1dc45f',1,]]], - ['nppistintegralgetsize_5f32f32f_388',['nppiStIntegralGetSize_32f32f',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga83a3047bd6d61467b192beb4bb17a00c',1,]]], - ['nppistintegralgetsize_5f8u32u_389',['nppiStIntegralGetSize_8u32u',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga91f663804d1664dacb1b4960113132bc',1,]]], - ['nppistinterpolateframes_390',['nppiStInterpolateFrames',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gaa1c83393b008cfda0a2ececc67f8e65d',1,]]], - ['nppistrectstddev_5f32f_5fc1r_391',['nppiStRectStdDev_32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga2bdca3cdf59ae4a68c2ce1cfec567c3c',1,]]], - ['nppistrectstddev_5f32f_5fc1r_5fhost_392',['nppiStRectStdDev_32f_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gae5ef85171ce1a561526b944ac529dc32',1,]]], - ['nppistresize_5f32f_5fc1r_393',['nppiStResize_32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga5e3319fdc5bf2807c4fa57d185cdbaa5',1,]]], - ['nppistsqrintegral_5f8u64u_5fc1r_394',['nppiStSqrIntegral_8u64u_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga752b7fb369792ade2873233dc5e544f1',1,]]], - ['nppistsqrintegral_5f8u64u_5fc1r_5fhost_395',['nppiStSqrIntegral_8u64u_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga1c5bde72920da90b07bd6cb1793e3ecc',1,]]], - ['nppistsqrintegralgetsize_5f8u64u_396',['nppiStSqrIntegralGetSize_8u64u',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga4e0f56a59a0ccbd45826edd4b25ea40b',1,]]], - ['nppisttranspose_5f128_5fc1r_397',['nppiStTranspose_128_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga06ca25fa65ae93754dc078c2200071a3',1,]]], - ['nppisttranspose_5f128_5fc1r_5fhost_398',['nppiStTranspose_128_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga13a2a25e90a3d6c91a6eea236efdc4a6',1,]]], - ['nppisttranspose_5f32f_5fc1r_399',['nppiStTranspose_32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga135742eb612a7cc0e4a12b0b7f128d3a',1,]]], - ['nppisttranspose_5f32f_5fc1r_5fhost_400',['nppiStTranspose_32f_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga01395679caf9a5a52c418ea7eddc4feb',1,]]], - ['nppisttranspose_5f32s_5fc1r_401',['nppiStTranspose_32s_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga2a3fe0595d83469325c6f5edf46e012b',1,]]], - ['nppisttranspose_5f32s_5fc1r_5fhost_402',['nppiStTranspose_32s_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga342e4f4fccc1f5c1514d912112b263ee',1,]]], - ['nppisttranspose_5f32u_5fc1r_403',['nppiStTranspose_32u_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gad7ba74e6d2fc65c0d5e3c8d8eb5b748a',1,]]], - ['nppisttranspose_5f32u_5fc1r_5fhost_404',['nppiStTranspose_32u_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga7dea5337b2f97142ef2b2359def09245',1,]]], - ['nppisttranspose_5f64f_5fc1r_405',['nppiStTranspose_64f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga3eb1ea72683f5096a3ae1b92cb366e79',1,]]], - ['nppisttranspose_5f64f_5fc1r_5fhost_406',['nppiStTranspose_64f_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga8af00cbb989165d71e369940369abd0b',1,]]], - ['nppisttranspose_5f64s_5fc1r_407',['nppiStTranspose_64s_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gac2523729dffe2f9254d091835bdf0e37',1,]]], - ['nppisttranspose_5f64s_5fc1r_5fhost_408',['nppiStTranspose_64s_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga230fcc284efd87a1a9675de223961fe2',1,]]], - ['nppisttranspose_5f64u_5fc1r_409',['nppiStTranspose_64u_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga779ad91eedf3b75e1ea9b03a0e7a2a14',1,]]], - ['nppisttranspose_5f64u_5fc1r_5fhost_410',['nppiStTranspose_64u_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gaef5ac7d73a8615562d90a777e098c53d',1,]]], - ['nppistvectorwarp_5fpsf1x1_5f32f_5fc1_411',['nppiStVectorWarp_PSF1x1_32f_C1',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga262306275af47e2cfa3de1dd06cea5a1',1,]]], - ['nppistvectorwarp_5fpsf2x2_5f32f_5fc1_412',['nppiStVectorWarp_PSF2x2_32f_C1',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gaf5bfc308f7f77d33a424ca53164ad3a6',1,]]], - ['nppistvectorwarpgetbuffersize_413',['nppiStVectorWarpGetBufferSize',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga641c538764b924048fed9cac8eee63a3',1,]]], - ['nppsstcompact_5f32f_414',['nppsStCompact_32f',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga440ba655fd72979cbffee797cfeaaec0',1,]]], - ['nppsstcompact_5f32f_5fhost_415',['nppsStCompact_32f_host',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#gad17df26ff439981ea24dd4fad8334ed3',1,]]], - ['nppsstcompact_5f32s_416',['nppsStCompact_32s',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga338be6eb29e6ad3835d5128414077ef6',1,]]], - ['nppsstcompact_5f32s_5fhost_417',['nppsStCompact_32s_host',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga0bc23f35382c9609c449c94503a08a4d',1,]]], - ['nppsstcompact_5f32u_418',['nppsStCompact_32u',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga8affd8f556e07d9b10c150fb98d40364',1,]]], - ['nppsstcompact_5f32u_5fhost_419',['nppsStCompact_32u_host',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#gaea57bb241aac5e10d4fdac6b30655e26',1,]]], - ['nppsstcompactgetsize_5f32f_420',['nppsStCompactGetSize_32f',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga815868ea68f1cf070de75ead6b4793a9',1,]]], - ['nppsstcompactgetsize_5f32s_421',['nppsStCompactGetSize_32s',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga500430cc2130b1ab6cff9beabf8b5174',1,]]], - ['nppsstcompactgetsize_5f32u_422',['nppsStCompactGetSize_32u',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga82852a492d20ab7ec1a706a315642f4e',1,]]], - ['nppst_20core_423',['NPPST Core',['https://docs.opencv.org/4.2.0/d5/ddd/group__core__npp.html',1,'']]], - ['nppst_20image_20processing_424',['NPPST Image Processing',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html',1,'']]], - ['nppst_20signal_20processing_425',['NPPST Signal Processing',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html',1,'']]], - ['nppst_5fcuda_5fkernel_5fexecution_5ferror_426',['NPPST_CUDA_KERNEL_EXECUTION_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a1485d49bcf34f4c8b9f26c2bae91ddc1',1,]]], - ['nppst_5ferror_427',['NPPST_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a423ee15b09c37f3a321fd0bb21379bb6',1,]]], - ['nppst_5finvalid_5froi_428',['NPPST_INVALID_ROI',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a33d1cdb1e0f69dc1eb4f5fe757794b0d',1,]]], - ['nppst_5finvalid_5fscale_429',['NPPST_INVALID_SCALE',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a5ef8a814660ade7442f3210368053686',1,]]], - ['nppst_5finvalid_5fstep_430',['NPPST_INVALID_STEP',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a313998ae688b9029f142f5bdfcda25e5',1,]]], - ['nppst_5fmem_5falloc_5ferr_431',['NPPST_MEM_ALLOC_ERR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a76678bd4071693de989b0c2b2971743e',1,]]], - ['nppst_5fmem_5finsufficient_5fbuffer_432',['NPPST_MEM_INSUFFICIENT_BUFFER',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725ac54252ecacba9ac29a8c8adf7787b7f4',1,]]], - ['nppst_5fmem_5finternal_5ferror_433',['NPPST_MEM_INTERNAL_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a69e3ac9796227461e2905630ad6152ce',1,]]], - ['nppst_5fmem_5fresidence_5ferror_434',['NPPST_MEM_RESIDENCE_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a89345ff6d17cbc2332c28b0b7f3a76ea',1,]]], - ['nppst_5fmemcpy_5ferror_435',['NPPST_MEMCPY_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a0fe175e4bae1e6c7a4fb220f42ff5e8f',1,]]], - ['nppst_5fmemfree_5ferr_436',['NPPST_MEMFREE_ERR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725af789d1385b3a4255b8c3e9322b21b3e2',1,]]], - ['nppst_5fnull_5fpointer_5ferror_437',['NPPST_NULL_POINTER_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a884e059b099f673fed83fec389b57289',1,]]], - ['nppst_5fsuccess_438',['NPPST_SUCCESS',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a60e77b014292362309dfc3ad536dc902',1,]]], - ['nppst_5ftexture_5fbind_5ferror_439',['NPPST_TEXTURE_BIND_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725aa160fb71a0d8bf914b4c5f6e6dd8f8a8',1,]]], - ['nppstbicubic_440',['nppStBicubic',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga0bfe03940f062d1a975f748a6ce9357da94c62fb3d22fb953e0769fc76b1bada2',1,]]], - ['nppstborderclamp_441',['nppStBorderClamp',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca54290d1cd5b3edc8d08fddf44a7b1d49',1,]]], - ['nppstbordermirror_442',['nppStBorderMirror',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca40998ebdca4e7972fa1649302b6a5793',1,]]], - ['nppstbordernone_443',['nppStBorderNone',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca84b1bfe04b1ff2cf60fcf67746e1eb48',1,]]], - ['nppstbordertype_444',['NppStBorderType',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga8b115979ee872d8e356c2f1f162d483c',1,]]], - ['nppstborderwrap_445',['nppStBorderWrap',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca00581d73e23c3cfa12ed297ad65342a1',1,]]], - ['nppstgetactivecudastream_446',['nppStGetActiveCUDAstream',['https://docs.opencv.org/4.2.0/d5/ddd/group__core__npp.html#ga97288d29b9fa9147b21cdcfcf4549e3b',1,]]], - ['nppstinterpmode_447',['NppStInterpMode',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga0bfe03940f062d1a975f748a6ce9357d',1,]]], - ['nppstinterpolationstate_448',['NppStInterpolationState',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html',1,'']]], - ['nppstsetactivecudastream_449',['nppStSetActiveCUDAstream',['https://docs.opencv.org/4.2.0/d5/ddd/group__core__npp.html#gae7bf7a1fddf4185a8f99a5617be3369a',1,]]], - ['nppstsupersample_450',['nppStSupersample',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga0bfe03940f062d1a975f748a6ce9357da712e2f6fc4e4a9d5d34c9cde78418e29',1,]]], - ['nrm_5ffull_451',['NRM_FULL',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151abcce140638cce986270b7d280fbc0cf8',1,'cv::xfeatures2d::DAISY']]], - ['nrm_5fnone_452',['NRM_NONE',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151a7c15db095b13e2ab1e13b292e201d259',1,'cv::xfeatures2d::DAISY']]], - ['nrm_5fpartial_453',['NRM_PARTIAL',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151a228d8972f227e53b7b1ffaddb979f55b',1,'cv::xfeatures2d::DAISY']]], - ['nrm_5fsift_454',['NRM_SIFT',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151a07e3a3513ec8b0d3b333cdb7ba964fca',1,'cv::xfeatures2d::DAISY']]], - ['nsobject_455',['NSObject',['https://docs.opencv.org/4.2.0/d4/d19/classNSObject.html',1,'']]], - ['nsobject_2dp_2dp_456',['NSObject-p-p',['https://docs.opencv.org/4.2.0/d9/d15/classNSObject-p.html',1,'']]], - ['nsobjectnsobject_2dp_2dp_457',['NSObjectNSObject-p-p',['https://docs.opencv.org/4.2.0/d5/d25/classNSObjectNSObject-p.html',1,'']]], - ['nstep_458',['nStep',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a6b2b89fd8ad1ef76a08b088a100a1673',1,'NppStInterpolationState']]], - ['nth_5felement_459',['nth_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a4f2ca9c1c627576aeeaa99181c8c63',1,'std::nth_element(_RandomAccessIterator __first, _RandomAccessIterator __nth, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6d43f0d62204409f18762c8e1bf1867b',1,'std::nth_element(_RandomAccessIterator __first, _RandomAccessIterator __nth, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a4f2ca9c1c627576aeeaa99181c8c63',1,'nth_element(_RandomAccessIterator __first, _RandomAccessIterator __nth, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6d43f0d62204409f18762c8e1bf1867b',1,'nth_element(_RandomAccessIterator __first, _RandomAccessIterator __nth, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['nth_5felement_5fminimal_5fn_460',['nth_element_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a34bef940cd171e22210e1c349152aab9',1,'__gnu_parallel::_Settings']]], - ['nu_461',['NU',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3ae0c1409f55f0158101fcc5e07f095605',1,'cv::ml::SVM']]], - ['nu02_462',['nu02',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ad15583ebb8f3b85acfb55442a6b8c533',1,'cv::Moments']]], - ['nu03_463',['nu03',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a1b5f0e8a3df615e6bb16f6cd89b9a646',1,'cv::Moments']]], - ['nu11_464',['nu11',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ade4cfa48ff5d25d8f24c789282163aa5',1,'cv::Moments']]], - ['nu12_465',['nu12',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ad0cdde3c12b9bf65a97da0d2e7e65e98',1,'cv::Moments']]], - ['nu20_466',['nu20',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a60e0eda02ec9ed4646673bd2b6b72545',1,'cv::Moments']]], - ['nu21_467',['nu21',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a429e531e475a2619195c4787c4992a62',1,'cv::Moments']]], - ['nu30_468',['nu30',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a223d272dc5ec3efe401d6dd1c4fb3087',1,'cv::Moments']]], - ['nu_5fsvc_469',['NU_SVC',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa50c44a78c88f3cde09599fba4347134d',1,'cv::ml::SVM']]], - ['nu_5fsvr_470',['NU_SVR',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa5b4b7e4b189d47be1765b3c6b19f6c80',1,'cv::ml::SVM']]], - ['null_471',['null',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a0ad26edef3f8d530dcec3192bba82df6.html#a0ad26edef3f8d530dcec3192bba82df6',1,'nlohmann::json_sax']]], - ['null_472',['Null',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a680af5adfeeb1cdaa5b7b13f680c0131',1,'cv::cuda::Stream']]], - ['null_5fnode_5fmetadata_2ehpp_473',['null_node_metadata.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01238.html',1,'']]], - ['null_5fnode_5fupdate_474',['null_node_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11295.html',1,'__gnu_pbds']]], - ['null_5ftype_475',['null_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11291.html',1,'__gnu_pbds']]], - ['nullary_20expressions_476',['Matrix manipulation via nullary-expressions',['https://eigen.tuxfamily.org/dox/TopicCustomizing_NullaryExpr.html',1,'']]], - ['nullaryexpr_477',['NullaryExpr',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5dc65501accd02c30f7c1840c2a30a41',1,'Eigen::DenseBase::NullaryExpr(const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3340c9b997f5b53a0131cf927f93b54c',1,'Eigen::DenseBase::NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9752ee59976a4b4aad860ad1a9093e7f',1,'Eigen::DenseBase::NullaryExpr(Index size, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5dc65501accd02c30f7c1840c2a30a41',1,'DenseBase< ArrayWrapper< ExpressionType > >::NullaryExpr(const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3340c9b997f5b53a0131cf927f93b54c',1,'DenseBase< ArrayWrapper< ExpressionType > >::NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9752ee59976a4b4aad860ad1a9093e7f',1,'DenseBase< ArrayWrapper< ExpressionType > >::NullaryExpr(Index size, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5dc65501accd02c30f7c1840c2a30a41',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NullaryExpr(const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3340c9b997f5b53a0131cf927f93b54c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9752ee59976a4b4aad860ad1a9093e7f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NullaryExpr(Index size, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5dc65501accd02c30f7c1840c2a30a41',1,'DenseBase< Solve< Decomposition, RhsType > >::NullaryExpr(const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3340c9b997f5b53a0131cf927f93b54c',1,'DenseBase< Solve< Decomposition, RhsType > >::NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9752ee59976a4b4aad860ad1a9093e7f',1,'DenseBase< Solve< Decomposition, RhsType > >::NullaryExpr(Index size, const CustomNullaryOp &func)']]], - ['nulldeblurer_478',['NullDeblurer',['https://docs.opencv.org/4.2.0/dc/d86/classcv_1_1videostab_1_1NullDeblurer.html',1,'cv::videostab']]], - ['nullframesource_479',['NullFrameSource',['https://docs.opencv.org/4.2.0/dd/d5b/classcv_1_1videostab_1_1NullFrameSource.html',1,'cv::videostab']]], - ['nullinpainter_480',['NullInpainter',['https://docs.opencv.org/4.2.0/d4/d1d/classcv_1_1videostab_1_1NullInpainter.html',1,'cv::videostab']]], - ['nulllog_481',['NullLog',['https://docs.opencv.org/4.2.0/d6/d78/classcv_1_1videostab_1_1NullLog.html',1,'cv::videostab']]], - ['nullopt_482',['nullopt',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html#ga2221e221b29838a39e88d176b5859900',1,]]], - ['nullopt_5ft_483',['nullopt_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10079.html',1,'std::experimental::fundamentals_v1']]], - ['nulloutlierrejector_484',['NullOutlierRejector',['https://docs.opencv.org/4.2.0/d3/de9/classcv_1_1videostab_1_1NullOutlierRejector.html',1,'cv::videostab']]], - ['nulltype_485',['NullType',['https://docs.opencv.org/4.2.0/d5/d71/structcv_1_1cudev_1_1NullType.html',1,'cv::cudev']]], - ['nullwobblesuppressor_486',['NullWobbleSuppressor',['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1videostab_1_1NullWobbleSuppressor.html',1,'cv::videostab']]], - ['num_5fblocks_487',['num_blocks',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a8c8aff43771b4a33d923ce0e7b952540',1,'std::tr2::dynamic_bitset']]], - ['num_5fchildren_488',['num_children',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a78db74c5de3cfff1de97561e5d530147',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::num_children()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a78db74c5de3cfff1de97561e5d530147',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::num_children()']]], - ['num_5ferrs_5fper_5fmeasurement_5f_489',['num_errs_per_measurement_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a316c5f7ee2a86061f1aab7169aa78bac',1,'cv::detail::BundleAdjusterBase']]], - ['num_5ffeatures_490',['num_features',['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a4953b74f4c9c06fbd4fe5419f8b5a546',1,'cv::linemod::ColorGradient::num_features'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a7eaa7bd397f3f797c1ba05eb6c068ca9',1,'cv::linemod::DepthNormal::num_features']]], - ['num_5fget_491',['num_get',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html',1,'std::num_get< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a074eb427906209a5fbfa7f069ede6b6b',1,'std::num_get::num_get()']]], - ['num_5fhog_5fchannels_5fused_492',['num_hog_channels_used',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#aa96bc7c04e832dd5e5e57fe3270dc40a',1,'cv::TrackerCSRT::Params']]], - ['num_5fimages_5f_493',['num_images_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a195a4414e1e513a21ad1290cafb2c455',1,'cv::detail::BundleAdjusterBase']]], - ['num_5fin_494',['num_in',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#a75f7bf27319d7cc4be75276b2e2ed861',1,'cv::gapi::ie::detail::ParamDesc']]], - ['num_5finflexion_5fpoints_495',['num_inflexion_points',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a2b1f8919722218f49ae86bc00c48721e',1,'cv::text::ERStat']]], - ['num_5finliers_496',['num_inliers',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#a905005225c80c0b865e44508189634b8',1,'cv::detail::MatchesInfo']]], - ['num_5fmatches_5fthresh1_5f_497',['num_matches_thresh1_',['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#a9feea2b5ac622dcacf9eba2f5a27dafd',1,'cv::detail::BestOf2NearestMatcher']]], - ['num_5fmatches_5fthresh2_5f_498',['num_matches_thresh2_',['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#ad1395b7d534b402b215519b6e9ac8bd9',1,'cv::detail::BestOf2NearestMatcher']]], - ['num_5fout_499',['num_out',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#a91fcee8a7d169d5e0785458c7fb8219f',1,'cv::gapi::ie::detail::ParamDesc']]], - ['num_5fparams_5fper_5fcam_5f_500',['num_params_per_cam_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a53a2fe05702415fbf2926179032c727b',1,'cv::detail::BundleAdjusterBase']]], - ['num_5fput_501',['num_put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html',1,'std::num_put< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a8c248a63cf9ad3dcf26f93f1b1b75d9c',1,'std::num_put::num_put()']]], - ['num_5fref_5fpoints_502',['num_ref_points',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a5aa5adb0a18007b213fb09852f24687c',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['num_5fsplit_503',['num_split',['https://docs.opencv.org/4.2.0/de/d61/classcv_1_1dnn_1_1SliceLayer.html#a97107f7a9f903380576952c526f0425c',1,'cv::dnn::SliceLayer']]], - ['num_5ftest_5fcoordinates_504',['num_test_coordinates',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a154ffe1d90e20d6d940900a682ad3875',1,'cv::face::FacemarkKazemi::Params']]], - ['num_5ftest_5fsplits_505',['num_test_splits',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a148be99b10aac689210a4e42e8fa6cd6',1,'cv::face::FacemarkKazemi::Params']]], - ['num_5ftrees_5fper_5fcascade_5flevel_506',['num_trees_per_cascade_level',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#ad26da85380c6dc4a7f3e27934fb174e1',1,'cv::face::FacemarkKazemi::Params']]], - ['numbands_507',['numBands',['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html#a150b2708c084e00b107fcc42d0298e98',1,'cv::detail::MultiBandBlender']]], - ['number_20distributions_508',['Random Number Distributions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01542.html',1,'']]], - ['number_20generation_509',['Random Number Generation',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01500.html',1,'']]], - ['number_20generators_510',['Random Number Generators',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html',1,'']]], - ['number_20utilities_511',['Random Number Utilities',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01547.html',1,'']]], - ['number_5ffloat_512',['number_float',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_ae7c31614e8a82164d2d7f8dbf4671b25.html#ae7c31614e8a82164d2d7f8dbf4671b25',1,'nlohmann::json_sax']]], - ['number_5ffloat_5ft_513',['number_float_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5b8abaebd922d82d69756327c0c347e6.html#a5b8abaebd922d82d69756327c0c347e6',1,'nlohmann::basic_json::number_float_t'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a390c209bffd8c4800c8f3076dc465a20.html#a390c209bffd8c4800c8f3076dc465a20',1,'nlohmann::json_sax::number_float_t']]], - ['number_5finteger_514',['number_integer',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_affa7a78b8e9cc9cc3ac99927143142a5.html#affa7a78b8e9cc9cc3ac99927143142a5',1,'nlohmann::json_sax']]], - ['number_5finteger_5ft_515',['number_integer_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a11e390944da90db83089eb2426a749d3.html#a11e390944da90db83089eb2426a749d3',1,'nlohmann::basic_json::number_integer_t'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a0cef30121f02b7fee85e9708148ea0aa.html#a0cef30121f02b7fee85e9708148ea0aa',1,'nlohmann::json_sax::number_integer_t']]], - ['number_5fof_5finner_5fiterations_516',['number_of_inner_iterations',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#a4d4ccb8be909ebdecaa392ee27324a9f',1,'NCVBroxOpticalFlowDescriptor']]], - ['number_5fof_5fouter_5fiterations_517',['number_of_outer_iterations',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#a53fdc567ae0d0b5aeb05f8dd8105f518',1,'NCVBroxOpticalFlowDescriptor']]], - ['number_5fof_5fscales_518',['number_of_scales',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#ad08546bf074b482ed819a528e9c4aa8d',1,'cv::TrackerCSRT::Params']]], - ['number_5fof_5fsolver_5fiterations_519',['number_of_solver_iterations',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#aacbc235d882971d08e1e1c52b0e8d200',1,'NCVBroxOpticalFlowDescriptor']]], - ['number_5funsigned_520',['number_unsigned',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_ad9b253083e0509923ba195136f49face.html#ad9b253083e0509923ba195136f49face',1,'nlohmann::json_sax']]], - ['number_5funsigned_5ft_521',['number_unsigned_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ae09af9c23351b7245d9be4d1b2035fef.html#ae09af9c23351b7245d9be4d1b2035fef',1,'nlohmann::basic_json::number_unsigned_t'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a32028cc056ae0f43aaae331cdbbbf856.html#a32028cc056ae0f43aaae331cdbbbf856',1,'nlohmann::json_sax::number_unsigned_t']]], - ['numbers_522',['Complex Numbers',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html',1,'']]], - ['numclasses_523',['numClasses',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#acd7e2e72ced11b7338e127baf5654968',1,'cv::linemod::Detector']]], - ['numclassifierrootnodes_524',['NumClassifierRootNodes',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#ad3a96f77c2a3fd3377d38344970eadb5',1,'HaarClassifierCascadeDescriptor']]], - ['numclassifiers_525',['numClassifiers',['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#af5ca5c19ee7883c7d3a7ada6385dbcfc',1,'cv::TrackerBoosting::Params']]], - ['numclassifiertotalnodes_526',['NumClassifierTotalNodes',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#ac06d944bc6beabe293f6e9ef9b928e82',1,'HaarClassifierCascadeDescriptor']]], - ['numcodecs_527',['NumCodecs',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a53004f410b4576c429f9b82b34d0bc89',1,'cv::cudacodec::NumCodecs'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a53004f410b4576c429f9b82b34d0bc89',1,'NumCodecs(Global Namespace)']]], - ['numdetectedframes_528',['numDetectedFrames',['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#a6dee9fbd7cfda3cd478bf228c4ae4ef5',1,'cv::DetectionBasedTracker::TrackedObject']]], - ['numdimensions_529',['NumDimensions',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'Eigen::DenseBase::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'DenseBase< ArrayWrapper< ExpressionType > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'DenseBase< Solve< Decomposition, RhsType > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'Eigen::SparseMatrixBase::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< Transpose< MatrixType > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::NumDimensions']]], - ['numeric_530',['numeric',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00113.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a50c9f58112ca40d3d53b07e1d524228b',1,'std::locale::numeric']]], - ['numeric_531',['Numeric',['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html',1,'']]], - ['numeric_20arrays_532',['Numeric Arrays',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html',1,'']]], - ['numeric_20operations_533',['Generalized Numeric operations',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html',1,'']]], - ['numeric_2ehpp_534',['numeric.hpp',['https://docs.opencv.org/4.2.0/de/dd5/numeric_8hpp.html',1,'']]], - ['numeric_5flimits_535',['numeric_limits',['https://docs.opencv.org/4.2.0/db/dc8/structcv_1_1cudev_1_1numeric__limits.html',1,'cv::cudev::numeric_limits< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html',1,'std::numeric_limits< class >']]], - ['numeric_5flimits_3c_20bool_20_3e_536',['numeric_limits< bool >',['https://docs.opencv.org/4.2.0/da/d81/structcv_1_1cudev_1_1numeric__limits_3_01bool_01_4.html',1,'cv::cudev::numeric_limits< bool >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02535.html',1,'std::numeric_limits< bool >']]], - ['numeric_5flimits_3c_20char_20_3e_537',['numeric_limits< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02539.html',1,'std']]], - ['numeric_5flimits_3c_20char16_5ft_20_3e_538',['numeric_limits< char16_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02555.html',1,'std']]], - ['numeric_5flimits_3c_20char32_5ft_20_3e_539',['numeric_limits< char32_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02559.html',1,'std']]], - ['numeric_5flimits_3c_20double_20_3e_540',['numeric_limits< double >',['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html',1,'cv::cudev::numeric_limits< double >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02599.html',1,'std::numeric_limits< double >']]], - ['numeric_5flimits_3c_20float_20_3e_541',['numeric_limits< float >',['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html',1,'cv::cudev::numeric_limits< float >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02595.html',1,'std::numeric_limits< float >']]], - ['numeric_5flimits_3c_20int_20_3e_542',['numeric_limits< int >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02571.html',1,'std']]], - ['numeric_5flimits_3c_20long_20_3e_543',['numeric_limits< long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02579.html',1,'std']]], - ['numeric_5flimits_3c_20long_20double_20_3e_544',['numeric_limits< long double >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02603.html',1,'std']]], - ['numeric_5flimits_3c_20long_20long_20_3e_545',['numeric_limits< long long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02587.html',1,'std']]], - ['numeric_5flimits_3c_20schar_20_3e_546',['numeric_limits< schar >',['https://docs.opencv.org/4.2.0/da/d4e/structcv_1_1cudev_1_1numeric__limits_3_01schar_01_4.html',1,'cv::cudev']]], - ['numeric_5flimits_3c_20short_20_3e_547',['numeric_limits< short >',['https://docs.opencv.org/4.2.0/d1/d8b/structcv_1_1cudev_1_1numeric__limits_3_01short_01_4.html',1,'cv::cudev::numeric_limits< short >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02563.html',1,'std::numeric_limits< short >']]], - ['numeric_5flimits_3c_20signed_20char_20_3e_548',['numeric_limits< signed char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02543.html',1,'std']]], - ['numeric_5flimits_3c_20uchar_20_3e_549',['numeric_limits< uchar >',['https://docs.opencv.org/4.2.0/d3/dc7/structcv_1_1cudev_1_1numeric__limits_3_01uchar_01_4.html',1,'cv::cudev']]], - ['numeric_5flimits_3c_20uint_20_3e_550',['numeric_limits< uint >',['https://docs.opencv.org/4.2.0/dd/d89/structcv_1_1cudev_1_1numeric__limits_3_01uint_01_4.html',1,'cv::cudev']]], - ['numeric_5flimits_3c_20unsigned_20char_20_3e_551',['numeric_limits< unsigned char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02547.html',1,'std']]], - ['numeric_5flimits_3c_20unsigned_20int_20_3e_552',['numeric_limits< unsigned int >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02575.html',1,'std']]], - ['numeric_5flimits_3c_20unsigned_20long_20_3e_553',['numeric_limits< unsigned long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02583.html',1,'std']]], - ['numeric_5flimits_3c_20unsigned_20long_20long_20_3e_554',['numeric_limits< unsigned long long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02591.html',1,'std']]], - ['numeric_5flimits_3c_20unsigned_20short_20_3e_555',['numeric_limits< unsigned short >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02567.html',1,'std']]], - ['numeric_5flimits_3c_20ushort_20_3e_556',['numeric_limits< ushort >',['https://docs.opencv.org/4.2.0/df/d47/structcv_1_1cudev_1_1numeric__limits_3_01ushort_01_4.html',1,'cv::cudev']]], - ['numeric_5flimits_3c_20wchar_5ft_20_3e_557',['numeric_limits< wchar_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02551.html',1,'std']]], - ['numeric_5ftraits_2eh_558',['numeric_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01064.html',1,'']]], - ['numericalissue_559',['NumericalIssue',['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea1c6e20706575a629b27a105f07f1883b',1,'Eigen::NumericalIssue'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea1c6e20706575a629b27a105f07f1883b',1,'NumericalIssue(Global Namespace)']]], - ['numericaljacobian_560',['numericalJacobian',['../namespaceutil.html#a7e9d28b43adad26f05fd6a983e53b032',1,'util']]], - ['numericfwd_2eh_561',['numericfwd.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00929.html',1,'']]], - ['numerics_562',['Numerics',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01482.html',1,'']]], - ['numfeatures_563',['NumFeatures',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#a21bd5b9e52ecfb00ddbec3bd88df65cb',1,'HaarClassifierCascadeDescriptor']]], - ['numfeatures_564',['numFeatures',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a07f6d9031861da09df711cfc5d6d4d5b',1,'cv::CvFeatureEvaluator::numFeatures'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#ab7eb8578a2e582d6acac9db71ab69fcc',1,'cv::CvFeatureParams::numFeatures'],['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html#a540d5f029fbf504751a4ea99f55c9fe5',1,'cv::TrackerFeatureHAAR::Params::numFeatures']]], - ['numformats_565',['NumFormats',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga1887af7daca9ccca0f51f90bc8777280a1ce1da9c8116af9a854e89c357cefd05',1,'cv::cudacodec::NumFormats'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga1887af7daca9ccca0f51f90bc8777280a1ce1da9c8116af9a854e89c357cefd05',1,'NumFormats(Global Namespace)']]], - ['numframes_566',['numFrames',['https://docs.opencv.org/4.2.0/d3/dad/structcv_1_1datasets_1_1GR__chalearnObj.html#a5de85d16d4b55bb7ba094c2cb6d94b15',1,'cv::datasets::GR_chalearnObj']]], - ['numframesnotdetected_567',['numFramesNotDetected',['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#a04b096c1a1a334b1aae3300fb7336d32',1,'cv::DetectionBasedTracker::TrackedObject']]], - ['numiterperscale_5f_568',['numIterPerScale_',['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html#a36d93786fcb2fe4599389ab3aac7e786',1,'cv::reg::MapperPyramid']]], - ['numlastpositionstotrack_569',['numLastPositionsToTrack',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a2a58d6c53d4e525c891ec89a92df436b',1,'cv::DetectionBasedTracker::InnerParameters']]], - ['numlev_5f_570',['numLev_',['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html#a19463232045102b4ff85d05444104c49',1,'cv::reg::MapperPyramid']]], - ['numofoctave_5f_571',['numOfOctave_',['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#a5031b4c8286e96254ff46ca872fe4008',1,'cv::line_descriptor::BinaryDescriptor::Params']]], - ['numofpixels_572',['numOfPixels',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a5ef7fe33dd5d4096e679148c50bdb64e',1,'cv::line_descriptor::KeyLine']]], - ['numoutput_573',['numOutput',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html#af5a8966504dc3dcf40894731fc899b1d',1,'cv::dnn::BaseConvolutionLayer']]], - ['numpunct_574',['numpunct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html',1,'std::numpunct< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#ab735f1fdfc597150f2cb2619735d75bb',1,'std::numpunct::numpunct(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a14c5c77559d8e42b3bf279f9508232db',1,'std::numpunct::numpunct(__cache_type *__cache, size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aea7df1e8fe9c7bd9969e92c5efd2e3e0',1,'std::numpunct::numpunct(__c_locale __cloc, size_t __refs=0)']]], - ['numpunct_5fbyname_575',['numpunct_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05955.html',1,'std']]], - ['numstages_576',['NumStages',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#a95d5c1f21f7e1474ca8ec409373229d2',1,'HaarClassifierCascadeDescriptor']]], - ['numstepstoshowwithoutdetecting_577',['numStepsToShowWithoutDetecting',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a102b08d61404b141e997e8bd0370d753',1,'cv::DetectionBasedTracker::InnerParameters']]], - ['numstepstotrackwithoutdetectingifobjecthasnotbeenshown_578',['numStepsToTrackWithoutDetectingIfObjectHasNotBeenShown',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#ab606d5b2e44d0f8f06d79ae26fc21906',1,'cv::DetectionBasedTracker::InnerParameters']]], - ['numstepstowaitbeforefirstshow_579',['numStepsToWaitBeforeFirstShow',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a8ab7c8d16dc319344fbe1cd8983e347f',1,'cv::DetectionBasedTracker::InnerParameters']]], - ['numtemplates_580',['numTemplates',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a0838546464e172e3e57cfc5cd1cac98f',1,'cv::linemod::Detector::numTemplates() const'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#ad4ee440463a0c2214f830ea12fa4f4bd',1,'cv::linemod::Detector::numTemplates(const String &class_id) const']]], - ['numtrackedsteps_581',['numTrackedSteps',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#adb616a0b54da056cc7ee96963bba52e3',1,'cv::DetectionBasedTracker']]], - ['numtraits_582',['NumTraits',['https://eigen.tuxfamily.org/dox/structEigen_1_1NumTraits.html',1,'Eigen']]], - ['numtraits_3c_20scalar_20_3e_583',['NumTraits< Scalar >',['https://eigen.tuxfamily.org/dox/structEigen_1_1NumTraits.html',1,'']]], - ['numtraits_3c_20typename_20matrixtype_3a_3ascalar_20_3e_584',['NumTraits< typename MatrixType::Scalar >',['https://eigen.tuxfamily.org/dox/structEigen_1_1NumTraits.html',1,'']]], - ['numvertices_585',['numVertices',['https://docs.opencv.org/4.2.0/dc/d4c/classcv_1_1detail_1_1Graph.html#a8f71b977899774233d495be13a3d400b',1,'cv::detail::Graph']]], - ['numvotes_586',['numVotes',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#adeedb890c88c752e80f3d36a24ff2d3b',1,'cv::ppf_match_3d::Pose3D::numVotes'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#ac2708187fcdf45ae3ff3df2d54c3f48a',1,'cv::ppf_match_3d::PoseCluster3D::numVotes']]], - ['nv12tobgr_587',['NV12toBGR',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga26fa592432479d54a56e66227f818d7c',1,'cv::gapi::NV12toBGR()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga26fa592432479d54a56e66227f818d7c',1,'NV12toBGR()(Global Namespace)']]], - ['nv12tobgrp_588',['NV12toBGRp',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#gaa41eebd2d72389dcf282850520bd8498',1,'cv::gapi::NV12toBGRp()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#gaa41eebd2d72389dcf282850520bd8498',1,'NV12toBGRp()(Global Namespace)']]], - ['nv12torgb_589',['NV12toRGB',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga0a8da2537ef9dd90d97e4681ca0ff6c6',1,'cv::gapi::NV12toRGB()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga0a8da2537ef9dd90d97e4681ca0ff6c6',1,'NV12toRGB()(Global Namespace)']]], - ['nv12torgbp_590',['NV12toRGBp',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga827c85675868381815af086868e450d6',1,'cv::gapi::NV12toRGBp()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga827c85675868381815af086868e450d6',1,'NV12toRGBp()(Global Namespace)']]], - ['nv_5fof_5fperf_5flevel_5ffast_591',['NV_OF_PERF_LEVEL_FAST',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883baf286f574f3b4423bca135a6065bc5dc1',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], - ['nv_5fof_5fperf_5flevel_5fmax_592',['NV_OF_PERF_LEVEL_MAX',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883bafd171d2741a73d833599a11fcb5e39a1',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], - ['nv_5fof_5fperf_5flevel_5fmedium_593',['NV_OF_PERF_LEVEL_MEDIUM',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883ba3801f2bcf9bf58936ba8488db067efff',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], - ['nv_5fof_5fperf_5flevel_5fslow_594',['NV_OF_PERF_LEVEL_SLOW',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883babe6c4386a3af6c5ff3dcaa1d57ed1276',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], - ['nv_5fof_5fperf_5flevel_5fundefined_595',['NV_OF_PERF_LEVEL_UNDEFINED',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883ba4320ccbbaea021d136ec50e1212d1ee1',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], - ['nvidia_5fof_5fperf_5flevel_596',['NVIDIA_OF_PERF_LEVEL',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883b',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], - ['nvidiahwopticalflow_597',['NvidiaHWOpticalFlow',['https://docs.opencv.org/4.2.0/d5/d26/classcv_1_1cuda_1_1NvidiaHWOpticalFlow.html',1,'cv::cuda']]], - ['nvidiaopticalflow_5f1_5f0_598',['NvidiaOpticalFlow_1_0',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html',1,'cv::cuda']]], - ['nzcount_599',['nzcount',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ad0cd6ef01802341dda3e8b75af5933f0',1,'cv::SparseMat']]] + ['node_20js_242',['Using OpenCV.js In Node.js',['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'']]], + ['node_5fbegin_243',['node_begin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html#aca223c3ee20287cd81e0a2531f6c1ae9',1,'__gnu_pbds::detail::ov_tree_map::node_begin() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html#a0219630894698aa4bab588b80ff4ebce',1,'__gnu_pbds::detail::ov_tree_map::node_begin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html#a838ce48eabe1bc0e39ab30be4db3871d',1,'__gnu_pbds::detail::pat_trie_map::node_begin() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html#ac9b60cb2ae918dc8d324525d78a4f470',1,'__gnu_pbds::detail::pat_trie_map::node_begin()']]], + ['node_5fconst_5fiterator_244',['node_const_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'__gnu_pbds::detail::bin_search_tree_traits::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11647.html#a7956a5cdcec778e8abce36c69ccd3053',1,'__gnu_pbds::detail::bin_search_tree_traits< Key, null_type, Cmp_Fn, Node_Update, Node, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11879.html#aa623b4dd1c1f576ef1ad3f8643d2d24a',1,'__gnu_pbds::detail::tree_traits< Key, Mapped, Cmp_Fn, Node_Update, ov_tree_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'__gnu_pbds::detail::tree_traits< Key, Mapped, Cmp_Fn, Node_Update, rb_tree_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'__gnu_pbds::detail::tree_traits< Key, Mapped, Cmp_Fn, Node_Update, splay_tree_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11883.html#a37ce1fb575484aa3bcab916f9d2f5586',1,'__gnu_pbds::detail::tree_traits< Key, null_type, Cmp_Fn, Node_Update, ov_tree_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'__gnu_pbds::detail::tree_traits< Key, null_type, Cmp_Fn, Node_Update, rb_tree_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'__gnu_pbds::detail::tree_traits< Key, null_type, Cmp_Fn, Node_Update, splay_tree_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11959.html#a52596c1faa5ae4c55f2cbb7872c0e478',1,'__gnu_pbds::detail::trie_traits< Key, Mapped, _ATraits, Node_Update, pat_trie_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11963.html#a6b9b24aec02d5b81b47bdad843750d4f',1,'__gnu_pbds::detail::trie_traits< Key, null_type, _ATraits, Node_Update, pat_trie_tag, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'bin_search_tree_traits< Key, Mapped, Cmp_Fn, Node_Update, rb_tree_node_< types_traits< Key, Mapped, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, Mapped, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'bin_search_tree_traits< Key, Mapped, Cmp_Fn, Node_Update, splay_tree_node_< types_traits< Key, Mapped, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, Mapped, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'bin_search_tree_traits< Key, null_type, Cmp_Fn, Node_Update, rb_tree_node_< types_traits< Key, null_type, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, null_type, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >::node_const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html#a34153991f6bcc5f12afc0879ba367393',1,'bin_search_tree_traits< Key, null_type, Cmp_Fn, Node_Update, splay_tree_node_< types_traits< Key, null_type, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, null_type, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >::node_const_iterator']]], + ['node_5fend_245',['node_end',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html#a8e887ff6a27b34396414744b4dda3e29',1,'__gnu_pbds::detail::ov_tree_map::node_end() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html#a3201dc70375ce5c9646bf82e2dfaf110',1,'__gnu_pbds::detail::ov_tree_map::node_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html#ac7bae9afb7a1120013b017cf52409090',1,'__gnu_pbds::detail::pat_trie_map::node_end() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html#ad8f66bcf85fce7c72b57f9f050a302d7',1,'__gnu_pbds::detail::pat_trie_map::node_end()']]], + ['node_5fhandle_2eh_246',['node_handle.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00431.html',1,'']]], + ['node_5ftype_247',['node_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11903.html#a3df5e43907830910e3ce34d411088940',1,'__gnu_pbds::detail::pat_trie_base::node_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11903.html#a3df5e43907830910e3ce34d411088940',1,'__gnu_pbds::detail::pat_trie_map::node_type']]], + ['node_5fupdate_248',['node_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11959.html#a1d89507b401632d21a8afa5f8475db88',1,'__gnu_pbds::detail::trie_traits< Key, Mapped, _ATraits, Node_Update, pat_trie_tag, _Alloc >::node_update'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11963.html#a19326cc52a16fcfc9afe45cdfbb100bd',1,'__gnu_pbds::detail::trie_traits< Key, null_type, _ATraits, Node_Update, pat_trie_tag, _Alloc >::node_update']]], + ['nodecount_249',['nodeCount',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#af85adc1b8ca1660afcf00f8df02e532e',1,'cv::SparseMat::Hdr']]], + ['nodedata_250',['NodeData',['https://docs.opencv.org/4.2.0/d7/dc2/classcv_1_1instr_1_1NodeData.html',1,'cv::instr::NodeData'],['https://docs.opencv.org/4.2.0/d7/dc2/classcv_1_1instr_1_1NodeData.html#a641519557ec9bf51ad37ed4145cf7fef',1,'cv::instr::NodeData::NodeData(const char *funName=0, const char *fileName=NULL, int lineNum=0, void *retAddress=NULL, bool alwaysExpand=false, cv::instr::TYPE instrType=TYPE_GENERAL, cv::instr::IMPL implType=IMPL_PLAIN)'],['https://docs.opencv.org/4.2.0/d7/dc2/classcv_1_1instr_1_1NodeData.html#a6cf6fb25e7041e77c0e3d6374172baee',1,'cv::instr::NodeData::NodeData(NodeData &ref)']]], + ['nodedatatls_251',['NodeDataTls',['https://docs.opencv.org/4.2.0/da/df1/structcv_1_1instr_1_1NodeDataTls.html',1,'cv::instr::NodeDataTls'],['https://docs.opencv.org/4.2.0/da/df1/structcv_1_1instr_1_1NodeDataTls.html#a34016bdad236c128476f65d6e591fee2',1,'cv::instr::NodeDataTls::NodeDataTls()']]], + ['nodenelems_252',['nodeNElems',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a6f58d984f262f8ba6d49bec26b44a1ba',1,'cv::FileNodeIterator']]], + ['nodes_253',['nodes',['https://docs.opencv.org/4.2.0/d9/d8b/structhashtable__int.html#a95f66a365503d1e45ac4c90b7eca3673',1,'hashtable_int']]], + ['nodesize_254',['nodeSize',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#a7c640b50e79d174311bd058247a9f8e9',1,'cv::SparseMat::Hdr']]], + ['noexposurecompensator_255',['NoExposureCompensator',['https://docs.opencv.org/4.2.0/d2/dc1/classcv_1_1detail_1_1NoExposureCompensator.html',1,'cv::detail']]], + ['noise_20removing_20filter_256',['Periodic Noise Removing Filter',['https://docs.opencv.org/4.2.0/d2/d0b/tutorial_periodic_noise_removing_filter.html',1,'']]], + ['noisecovmat_257',['NoiseCovMat',['../classfilters_1_1statespace_1_1NoiseCovMat.html',1,'filters::statespace::NoiseCovMat< stateDim, size, paramSize >'],['../classfilters_1_1statespace_1_1NoiseCovMat.html#aca71d2b7eb001db879fbf7cd34b0d4d9',1,'filters::statespace::NoiseCovMat::NoiseCovMat(const Eigen::Matrix< double, size, 1 > &stdDevs)'],['../classfilters_1_1statespace_1_1NoiseCovMat.html#adab6097e466318ffbd2e18f4a0ead5e6',1,'filters::statespace::NoiseCovMat::NoiseCovMat(const Eigen::Matrix< double, size, size > &mat)'],['../classfilters_1_1statespace_1_1NoiseCovMat.html#a797787239ab515bfea3be8e68c543e59',1,'filters::statespace::NoiseCovMat::NoiseCovMat(const std::function< Eigen::Matrix< double, size, size >(const state_t &, const param_t &)> &func)'],['../classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4.html#a3443d32b2982b2a713ba146e0ec0e999',1,'filters::statespace::NoiseCovMat<-1, -1, -1 >::NoiseCovMat(const Eigen::VectorXd &stdDevs, int stateDim, int paramSize)'],['../classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4.html#a3ce04ea741d308fd9b395243a1d3e929',1,'filters::statespace::NoiseCovMat<-1, -1, -1 >::NoiseCovMat(const Eigen::MatrixXd &mat, int stateDim, int paramSize)'],['../classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4.html#a5321f825bad289c3cb3983d3b840cc2e',1,'filters::statespace::NoiseCovMat<-1, -1, -1 >::NoiseCovMat(const std::function< Eigen::MatrixXd(const Eigen::VectorXd &, const Eigen::VectorXd &)> &func, int stateDim, int size, int paramSize)']]], + ['noisecovmat_3c_20statedim_2c_20outputnoisedim_2c_20outputdim_20_3e_258',['NoiseCovMat< stateDim, outputNoiseDim, outputDim >',['../classfilters_1_1statespace_1_1NoiseCovMat.html',1,'filters::statespace']]], + ['noisecovmat_3c_20statedim_2c_20processnoisedim_2c_20inputdim_20_3e_259',['NoiseCovMat< stateDim, processNoiseDim, inputDim >',['../classfilters_1_1statespace_1_1NoiseCovMat.html',1,'filters::statespace']]], + ['noisecovmat_3c_2d1_2c_20_2d1_2c_20_2d1_20_3e_260',['NoiseCovMat<-1, -1, -1 >',['../classfilters_1_1statespace_1_1NoiseCovMat_3-1_00_01-1_00_01-1_01_4.html',1,'filters::statespace']]], + ['non_20free_202d_20features_20algorithms_261',['Non-free 2D Features Algorithms',['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html',1,'']]], + ['non_20linearly_20separable_20data_262',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], + ['non_20mutating_263',['Non-Mutating',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html',1,'']]], + ['non_20photorealistic_20rendering_264',['Non-Photorealistic Rendering',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html',1,'']]], + ['non_5fconst_5ftype_265',['non_const_type',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#ad49fd7ff0530be35d0a886df6afbff7d',1,'cv::cudev::TypeTraits']]], + ['non_5flinear_5fsvms_2emarkdown_266',['non_linear_svms.markdown',['https://docs.opencv.org/4.2.0/da/d42/non__linear__svms_8markdown.html',1,'']]], + ['non_5fmaximal_5fsuppression_267',['non_maximal_suppression',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a4b23cd5f68da58fae6bf70748dab2cef',1,'cv::dnn_objdetect::InferBbox']]], + ['non_5fvolatile_5ftype_268',['non_volatile_type',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a36525ea76a28e65537dd5da81b52651a',1,'cv::cudev::TypeTraits']]], + ['none_269',['NONE',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba7f22b71cc694233d39d400bb0192a30a',1,'cv::_InputArray::NONE'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a1ffa1550fdf90e132df54bf982e694cd',1,'cv::FileNode::NONE'],['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#aaee8f2a3f0f04415acca5f1ada1ce8eda9eef92f7409954282a9692e42a86a5cc',1,'cv::viz::KeyboardEvent::NONE'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1838399ee67c0957c0ae42cabfa99033aa3aa1dfcdc14255c12d84f9a932493b9',1,'cv::ogl::Texture2D::NONE']]], + ['none_270',['none',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a70bef0686be2c1b746e21069f73415b8',1,'std::locale::none'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a55acf106c98106e68dfb1e475176624b',1,'std::bitset::none()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a5399d063c80e2837bda0ff98a8435e50',1,'std::tr2::dynamic_bitset::none()'],['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html#gga3bdb11e4d5333d49ecab1e789fcce58eac10123dfa7c5e5311f56bea9cfbfe795',1,'cv::datasets::none'],['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html#gga3bdb11e4d5333d49ecab1e789fcce58eac10123dfa7c5e5311f56bea9cfbfe795',1,'none(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a334c4a4c42fdb79d7ebc3e73b517e6f8',1,'none(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a334c4a4c42fdb79d7ebc3e73b517e6f8',1,'none(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a334c4a4c42fdb79d7ebc3e73b517e6f8',1,'none(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a334c4a4c42fdb79d7ebc3e73b517e6f8',1,'none(Global Namespace)']]], + ['none_5fof_271',['none_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga245f9003d26e4ca6c9b304c4cca2c77f',1,'std::none_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga245f9003d26e4ca6c9b304c4cca2c77f',1,'none_of(_InputIterator __first, _InputIterator __last, _Predicate __pred)(Global Namespace)']]], + ['nonfree_2ehpp_272',['nonfree.hpp',['https://docs.opencv.org/4.2.0/dc/dcb/nonfree_8hpp.html',1,'']]], + ['nonlocalmeans_273',['nonLocalMeans',['https://docs.opencv.org/4.2.0/d1/d79/group__photo__denoise.html#gafa990f16548581987e7e509b435c3648',1,'cv::cuda::nonLocalMeans()'],['https://docs.opencv.org/4.2.0/d1/d79/group__photo__denoise.html#gafa990f16548581987e7e509b435c3648',1,'nonLocalMeans()(Global Namespace)']]], + ['nonmax_5fsuppression_274',['NONMAX_SUPPRESSION',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#aeb231abf4b24747a3e2f6ca4d99132caa2fb1b00216bfc495c99346bc8c11d328',1,'cv::AgastFeatureDetector::NONMAX_SUPPRESSION'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#aadc316b5df92d9e457c9c984f1bab7eea481d00b76bfc41ad8a6dabb17bb9abe0',1,'cv::FastFeatureDetector::NONMAX_SUPPRESSION']]], + ['nonzeropivots_275',['nonzeroPivots',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a796610bab81f0527aa1ae440c71f58a4',1,'Eigen::ColPivHouseholderQR::nonzeroPivots()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a796610bab81f0527aa1ae440c71f58a4',1,'ColPivHouseholderQR< MatrixType >::nonzeroPivots()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#af9d7a5bdbc16a4a0bf7394ef0dd208da',1,'Eigen::CompleteOrthogonalDecomposition::nonzeroPivots()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#af1e4d04824084a964c1a6e51db68376f',1,'Eigen::FullPivHouseholderQR::nonzeroPivots()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#aa71132a751ad3c78178e33d6b2987400',1,'Eigen::FullPivLU::nonzeroPivots()']]], + ['nonzeros_276',['nonZeros',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#acb8d5574eff335381e7441ade87700a0',1,'Eigen::DenseBase::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#acb8d5574eff335381e7441ade87700a0',1,'DenseBase< ArrayWrapper< ExpressionType > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#acb8d5574eff335381e7441ade87700a0',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#acb8d5574eff335381e7441ade87700a0',1,'DenseBase< Solve< Decomposition, RhsType > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'Eigen::SparseCompressedBase::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< Derived >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#ae53743108cd668b8da927ff149631fe0',1,'SparseCompressedBase< Transpose< MatrixType > >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a753e975b7b3643d821dc061141786870',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae53743108cd668b8da927ff149631fe0',1,'Eigen::SparseMatrix::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae53743108cd668b8da927ff149631fe0',1,'SparseMatrix< Scalar >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae53743108cd668b8da927ff149631fe0',1,'SparseMatrix< Scalar, ColMajor, int >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae53743108cd668b8da927ff149631fe0',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae53743108cd668b8da927ff149631fe0',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::nonZeros()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#a6c211a24bcd0af8a4e241c4704abffe0',1,'Eigen::SparseVector::nonZeros()']]], + ['nonzerosingularvalues_277',['nonzeroSingularValues',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#afe8a555f38393a319a71ec0f0331c9ef',1,'Eigen::SVDBase::nonzeroSingularValues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#afe8a555f38393a319a71ec0f0331c9ef',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::nonzeroSingularValues()']]], + ['nopreferredstorageorderbit_278',['NoPreferredStorageOrderBit',['https://eigen.tuxfamily.org/dox/group__flags.html#ga3c186ad80ddcf5e2ed3d7ee31cca1860',1,'Eigen::NoPreferredStorageOrderBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#ga3c186ad80ddcf5e2ed3d7ee31cca1860',1,'NoPreferredStorageOrderBit(Global Namespace)']]], + ['noqrpreconditioner_279',['NoQRPreconditioner',['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56ea2e95bc818f975b19def01e93d240dece',1,'Eigen::NoQRPreconditioner'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56ea2e95bc818f975b19def01e93d240dece',1,'NoQRPreconditioner(Global Namespace)']]], + ['norm_280',['norm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a196c4ec3c8ffdf5bda45d0f617154975',1,'Eigen::MatrixBase::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a196c4ec3c8ffdf5bda45d0f617154975',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a196c4ec3c8ffdf5bda45d0f617154975',1,'MatrixBase< Solve< Decomposition, RhsType > >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aad4b1faef1eabdc7fdd4d305e9881149',1,'Eigen::QuaternionBase::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aad4b1faef1eabdc7fdd4d305e9881149',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aad4b1faef1eabdc7fdd4d305e9881149',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aad4b1faef1eabdc7fdd4d305e9881149',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'Eigen::VectorwiseOp::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const Derived, Horizontal >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const Derived, Vertical >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::norm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#af726d1dfd9a7a67b76e639db1a9f352e',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::norm()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga4e556cb8ad35a643a1ea66e035711bb9',1,'cv::norm(const Matx< _Tp, m, n > &M)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7199682a392fe6788e4edc4eeb5a4b65',1,'cv::norm(const Matx< _Tp, m, n > &M, int normType)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga55a581f0accd8d990af775d378e7e46c',1,'cv::norm(InputArray src1, int normType=NORM_L2, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gae15fc2d956eb3a93ec65339a50dc7b6a',1,'cv::norm(InputArray src1, InputArray src2, int normType=NORM_L2, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7c331fb8dd951707e184ef4e3f21dd33',1,'cv::norm(const SparseMat &src, int normType)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga6c01988a58d92126a7c60a4ab76d8324',1,'cv::cuda::norm(InputArray src1, int normType, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga48b6298589b80a6915d076e2dcdbd11b',1,'cv::cuda::norm(InputArray src1, InputArray src2, int normType=NORM_L2)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga4e556cb8ad35a643a1ea66e035711bb9',1,'norm(const Matx< _Tp, m, n > &M)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7199682a392fe6788e4edc4eeb5a4b65',1,'norm(const Matx< _Tp, m, n > &M, int normType)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga55a581f0accd8d990af775d378e7e46c',1,'norm(InputArray src1, int normType=NORM_L2, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gae15fc2d956eb3a93ec65339a50dc7b6a',1,'norm(InputArray src1, InputArray src2, int normType=NORM_L2, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7c331fb8dd951707e184ef4e3f21dd33',1,'norm(const SparseMat &src, int normType)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga6c01988a58d92126a7c60a4ab76d8324',1,'norm(InputArray src1, int normType, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga48b6298589b80a6915d076e2dcdbd11b',1,'norm(InputArray src1, InputArray src2, int normType=NORM_L2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga18ce7540f44fe30715fca0cdb37c9241',1,'std::norm()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga18ce7540f44fe30715fca0cdb37c9241',1,'norm()(Global Namespace)']]], + ['norm_5fhamming_281',['NORM_HAMMING',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa4b063afd04aebb8dd07085a1207da727',1,'cv::NORM_HAMMING'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa4b063afd04aebb8dd07085a1207da727',1,'NORM_HAMMING(Global Namespace)']]], + ['norm_5fhamming2_282',['NORM_HAMMING2',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7fab9cda83e79380cd273c49de8e3231',1,'cv::NORM_HAMMING2'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7fab9cda83e79380cd273c49de8e3231',1,'NORM_HAMMING2(Global Namespace)']]], + ['norm_5finf_283',['NORM_INF',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fad33872d928c74f8a49d1ba06d72aefc3',1,'cv::NORM_INF'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fad33872d928c74f8a49d1ba06d72aefc3',1,'NORM_INF(Global Namespace)']]], + ['norm_5fl1_284',['NORM_L1',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fab55c78ff204a979026c026ea19de65c9',1,'cv::NORM_L1'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fab55c78ff204a979026c026ea19de65c9',1,'NORM_L1(Global Namespace)']]], + ['norm_5fl2_285',['NORM_L2',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7bacbe84d400336a8f26297d8e80e3a2',1,'cv::NORM_L2'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7bacbe84d400336a8f26297d8e80e3a2',1,'NORM_L2(Global Namespace)']]], + ['norm_5fl2sqr_286',['NORM_L2SQR',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fabe948af03c9289b0dd7e663d5c035f5a',1,'cv::NORM_L2SQR'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fabe948af03c9289b0dd7e663d5c035f5a',1,'NORM_L2SQR(Global Namespace)']]], + ['norm_5fminmax_287',['NORM_MINMAX',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa9f0c1c342a18114d47b516a88e29822e',1,'cv::NORM_MINMAX'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa9f0c1c342a18114d47b516a88e29822e',1,'NORM_MINMAX(Global Namespace)']]], + ['norm_5frelative_288',['NORM_RELATIVE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa0a85f9203dcdf3fbc1cca589b6f5df39',1,'cv::NORM_RELATIVE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa0a85f9203dcdf3fbc1cca589b6f5df39',1,'NORM_RELATIVE(Global Namespace)']]], + ['norm_5ftype_5fmask_289',['NORM_TYPE_MASK',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149faaabf1ea549554e2cbdfde2acfcfc5374',1,'cv::NORM_TYPE_MASK'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149faaabf1ea549554e2cbdfde2acfcfc5374',1,'NORM_TYPE_MASK(Global Namespace)']]], + ['normal_290',['NORMAL',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#aa2a27f17a1a30fad4c54c248b77777e0af115eca6e3361cd5ec6cb1887f0aabd3',1,'cv::xfeatures2d::PCTSignatures::NORMAL'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#ae0feca638ad1b7a6656794871700d8d1a85da6d7bc413e10a648f638151129a91',1,'cv::RNG::NORMAL']]], + ['normal_291',['normal',['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a567f2d13d5c9835f2884c329185e4c63',1,'Eigen::Hyperplane::normal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#abe6786725d6aae2e6ef6981395aeac46',1,'Eigen::Hyperplane::normal() const']]], + ['normal_20distributions_292',['Normal Distributions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html',1,'']]], + ['normal_5fclone_293',['NORMAL_CLONE',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca8e6473804ceaa0e8bd0e5828a05235a7',1,'cv::NORMAL_CLONE'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca8e6473804ceaa0e8bd0e5828a05235a7',1,'NORMAL_CLONE(Global Namespace)']]], + ['normal_5fdistribution_294',['normal_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html',1,'std::normal_distribution< _RealType >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae3d912adf379592d4b7fdd7557312bcf',1,'normal_distribution< double >::normal_distribution()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae3d912adf379592d4b7fdd7557312bcf',1,'normal_distribution< result_type >::normal_distribution()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae3d912adf379592d4b7fdd7557312bcf',1,'std::normal_distribution::normal_distribution()']]], + ['normal_5fdistribution_3c_20double_20_3e_295',['normal_distribution< double >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html',1,'']]], + ['normal_5fdistribution_3c_20result_5ftype_20_3e_296',['normal_distribution< result_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html',1,'']]], + ['normalbayesclassifier_297',['NormalBayesClassifier',['https://docs.opencv.org/4.2.0/d4/d8e/classcv_1_1ml_1_1NormalBayesClassifier.html',1,'cv::ml']]], + ['normaliseoutput_298',['normaliseOutput',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a4396c41915e446d630378aa4bb34a38b',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters::normaliseOutput'],['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#a88025fa1e453fb0262818c638742ff37',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters::normaliseOutput']]], + ['normalizationtype_299',['NormalizationType',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151',1,'cv::xfeatures2d::DAISY']]], + ['normalize_300',['normalize',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#aefc01541eeaf8063f6d2f19cc46fe0e0',1,'cv::reg::MapProjec::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ae090309b1a932e07a983ff7dd84a3120',1,'Eigen::Hyperplane::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad16303c47ba36f7a41ea264cb26bceb6',1,'Eigen::MatrixBase::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad16303c47ba36f7a41ea264cb26bceb6',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad16303c47ba36f7a41ea264cb26bceb6',1,'MatrixBase< Solve< Decomposition, RhsType > >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7a487a8a129b46be562f42044102c1f8',1,'Eigen::QuaternionBase::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7a487a8a129b46be562f42044102c1f8',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7a487a8a129b46be562f42044102c1f8',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7a487a8a129b46be562f42044102c1f8',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'Eigen::VectorwiseOp::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const Derived, Horizontal >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const Derived, Vertical >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::normalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#adb1084153780dc8d2c062fee97651a45',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::normalize()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1b6a396a456c8b6c6e4afd8591560d80',1,'cv::normalize(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga87eef7ee3970f86906d69a92cbf064bd',1,'cv::normalize(InputArray src, InputOutputArray dst, double alpha=1, double beta=0, int norm_type=NORM_L2, int dtype=-1, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7bcf47a1df78cf575162e0aed44960cb',1,'cv::normalize(const SparseMat &src, SparseMat &dst, double alpha, int normType)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga4da4738b9956a5baaa2f5f8c2fba438a',1,'cv::cuda::normalize()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaedda08934a12c8b4d8f3c1762f27cacc',1,'cv::gapi::normalize()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1b6a396a456c8b6c6e4afd8591560d80',1,'normalize(const Vec< _Tp, cn > &v)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga87eef7ee3970f86906d69a92cbf064bd',1,'normalize(InputArray src, InputOutputArray dst, double alpha=1, double beta=0, int norm_type=NORM_L2, int dtype=-1, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7bcf47a1df78cf575162e0aed44960cb',1,'normalize(const SparseMat &src, SparseMat &dst, double alpha, int normType)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaedda08934a12c8b4d8f3c1762f27cacc',1,'normalize(const GMat &src, double alpha, double beta, int norm_type, int ddepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga4da4738b9956a5baaa2f5f8c2fba438a',1,'normalize(InputArray src, OutputArray dst, double alpha, double beta, int norm_type, int dtype, InputArray mask=noArray(), Stream &stream=Stream::Null())(Global Namespace)']]], + ['normalizebboxlayer_301',['NormalizeBBoxLayer',['https://docs.opencv.org/4.2.0/dc/df8/classcv_1_1dnn_1_1NormalizeBBoxLayer.html',1,'cv::dnn']]], + ['normalized_302',['normalized',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5cf2fd4c57e59604fd4116158fd34308',1,'Eigen::MatrixBase::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5cf2fd4c57e59604fd4116158fd34308',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5cf2fd4c57e59604fd4116158fd34308',1,'MatrixBase< Solve< Decomposition, RhsType > >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ade799f18b7ec19c02ddae3a4921fa8a0',1,'Eigen::QuaternionBase::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ade799f18b7ec19c02ddae3a4921fa8a0',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ade799f18b7ec19c02ddae3a4921fa8a0',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ade799f18b7ec19c02ddae3a4921fa8a0',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'Eigen::VectorwiseOp::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const Derived, Horizontal >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const Derived, Vertical >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::normalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aca6ac44a9bf819d5d64c2cb54bf38095',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::normalized()']]], + ['normalizedeightpointsolver_303',['normalizedEightPointSolver',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaa37cc469d0c0573be08c3d55f6f1be8f',1,'cv::sfm::normalizedEightPointSolver()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaa37cc469d0c0573be08c3d55f6f1be8f',1,'normalizedEightPointSolver()(Global Namespace)']]], + ['normalizefundamental_304',['normalizeFundamental',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga99db07182e74de2ecf32d78fe1d5df41',1,'cv::sfm::normalizeFundamental()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga99db07182e74de2ecf32d78fe1d5df41',1,'normalizeFundamental()(Global Namespace)']]], + ['normalizeisotropicpoints_305',['normalizeIsotropicPoints',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga6dd543753e1ef54fe91a4f34e3bcfa81',1,'cv::sfm::normalizeIsotropicPoints()'],['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga6dd543753e1ef54fe91a4f34e3bcfa81',1,'normalizeIsotropicPoints()(Global Namespace)']]], + ['normalizepccoeff_306',['normalizePCCoeff',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaae4792bf8469222356c16364759941aa',1,'cv::ppf_match_3d::normalizePCCoeff()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaae4792bf8469222356c16364759941aa',1,'normalizePCCoeff()(Global Namespace)']]], + ['normalizepoints_307',['normalizePoints',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga2c1df04b9b822fbbb5f3a3c0c1c66ebb',1,'cv::sfm::normalizePoints()'],['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga2c1df04b9b822fbbb5f3a3c0c1c66ebb',1,'normalizePoints()(Global Namespace)']]], + ['normalizeusingweightmap_308',['normalizeUsingWeightMap',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#gad4eab2369179fcb46792aaef2b68425e',1,'cv::detail::normalizeUsingWeightMap()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#gad4eab2369179fcb46792aaef2b68425e',1,'normalizeUsingWeightMap()(Global Namespace)']]], + ['normals_309',['normals',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#afa1bf8f104bc7f0cfefc2bd2e38495f9',1,'cv::viz::Mesh::normals'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#a35770687c412e32902f350d217e94e1b',1,'cv::rgbd::RgbdFrame::normals']]], + ['normalscomputer_310',['normalsComputer',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#ad0363b8e3836257da95f548e26997bb6',1,'cv::rgbd::ICPOdometry::normalsComputer'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a8da046b88ef9b8aaba29827efc40522d',1,'cv::rgbd::RgbdICPOdometry::normalsComputer']]], + ['normbysize_311',['normBySize',['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#acc60d3ba59155867a3f885b0304e8d38',1,'cv::dnn::LRNLayer']]], + ['normconv_5ffilter_312',['NORMCONV_FILTER',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ggaf454b747a111dc9819419b99807ae7acaaab1c1e6dc436a25e1f5506fb6432d4e',1,'cv::NORMCONV_FILTER'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ggaf454b747a111dc9819419b99807ae7acaaab1c1e6dc436a25e1f5506fb6432d4e',1,'NORMCONV_FILTER(Global Namespace)']]], + ['normhamming_313',['NormHamming',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html',1,'cv::cudev::NormHamming'],['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a4c1e14a4da57f206855fefa496f96fa9',1,'cv::cudev::NormHamming::NormHamming()']]], + ['normhamming_314',['normHamming',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf779b175d6b59d5c36b76e58f17cf922',1,'cv::hal::normHamming(const uchar *a, int n)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gadf02bcb9c4a70f4e0f5a3dd66adfd897',1,'cv::hal::normHamming(const uchar *a, const uchar *b, int n)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga51ba95d472f3c7a349b5405e070f595e',1,'cv::hal::normHamming(const uchar *a, int n, int cellSize)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaa671377b42e39aaca23f5ee91f5a8004',1,'cv::hal::normHamming(const uchar *a, const uchar *b, int n, int cellSize)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf779b175d6b59d5c36b76e58f17cf922',1,'normHamming(const uchar *a, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gadf02bcb9c4a70f4e0f5a3dd66adfd897',1,'normHamming(const uchar *a, const uchar *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga51ba95d472f3c7a349b5405e070f595e',1,'normHamming(const uchar *a, int n, int cellSize)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaa671377b42e39aaca23f5ee91f5a8004',1,'normHamming(const uchar *a, const uchar *b, int n, int cellSize)(Global Namespace)']]], + ['normhistogramcostextractor_315',['NormHistogramCostExtractor',['https://docs.opencv.org/4.2.0/df/d65/classcv_1_1NormHistogramCostExtractor.html',1,'cv']]], + ['norminf_316',['normInf',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gafbc6702d6233a210781b69505fe35657',1,'cv::normInf(const _Tp *a, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga88d10ad6fabc12581122af0655f14528',1,'cv::normInf(const _Tp *a, const _Tp *b, int n)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga4d4f56eea9f26736f7d0c703b377f9e7',1,'cv::gapi::normInf()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gafbc6702d6233a210781b69505fe35657',1,'normInf(const _Tp *a, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga88d10ad6fabc12581122af0655f14528',1,'normInf(const _Tp *a, const _Tp *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga4d4f56eea9f26736f7d0c703b377f9e7',1,'normInf(const GMat &src)(Global Namespace)']]], + ['norml1_317',['NormL1',['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html',1,'cv::cudev::NormL1< class >'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#a06f9880799a16f7dc5db55d5d04016f0',1,'cv::cudev::NormL1::NormL1()'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#a4130bce8b8f40743899fc3023f1d6ad9',1,'cv::cudev::NormL1< float >::NormL1()']]], + ['norml1_318',['normL1',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gacb7cee5ed28705cf01ea141ae7927545',1,'cv::normL1(const _Tp *a, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga442c3185940fc1879e26e8676253e0c5',1,'cv::normL1(const _Tp *a, const _Tp *b, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gac43f78105ba75ece4056964547b23c19',1,'cv::normL1(const float *a, const float *b, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae0f0a5246a545bc9aff70680c9efed22',1,'cv::normL1(const uchar *a, const uchar *b, int n)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga238421ed8e075474f03acb06e7168b26',1,'cv::gapi::normL1()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gacb7cee5ed28705cf01ea141ae7927545',1,'normL1(const _Tp *a, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga442c3185940fc1879e26e8676253e0c5',1,'normL1(const _Tp *a, const _Tp *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gac43f78105ba75ece4056964547b23c19',1,'normL1(const float *a, const float *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae0f0a5246a545bc9aff70680c9efed22',1,'normL1(const uchar *a, const uchar *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga238421ed8e075474f03acb06e7168b26',1,'normL1(const GMat &src)(Global Namespace)']]], + ['norml1_3c_20float_20_3e_319',['NormL1< float >',['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html',1,'cv::cudev']]], + ['norml1_5f_320',['normL1_',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacb1b8548f147e1eeda793687beb6bba1',1,'cv::hal::normL1_(const uchar *a, const uchar *b, int n)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga78689e1adfb5b25291dacd03f85fd195',1,'cv::hal::normL1_(const float *a, const float *b, int n)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacb1b8548f147e1eeda793687beb6bba1',1,'normL1_(const uchar *a, const uchar *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga78689e1adfb5b25291dacd03f85fd195',1,'normL1_(const float *a, const float *b, int n)(Global Namespace)']]], + ['norml2_321',['NormL2',['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html',1,'cv::cudev::NormL2'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#a7e597e95eb7dc6bb1d80ac1b5b388239',1,'cv::cudev::NormL2::NormL2()']]], + ['norml2_322',['normL2',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gaeb09f3519bcc89b23ededc3925b9916f',1,'cv::gapi::normL2()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gaeb09f3519bcc89b23ededc3925b9916f',1,'normL2()(Global Namespace)']]], + ['norml2sqr_323',['normL2Sqr',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf0e07145e0927234be3e0311f0658e83',1,'cv::normL2Sqr(const _Tp *a, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae4cfcbe0059f7678012af41dbfcdfbe9',1,'cv::normL2Sqr(const _Tp *a, const _Tp *b, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6a653487f2dc0d579c803be43ddac124',1,'cv::normL2Sqr(const float *a, const float *b, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf0e07145e0927234be3e0311f0658e83',1,'normL2Sqr(const _Tp *a, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae4cfcbe0059f7678012af41dbfcdfbe9',1,'normL2Sqr(const _Tp *a, const _Tp *b, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6a653487f2dc0d579c803be43ddac124',1,'normL2Sqr(const float *a, const float *b, int n)(Global Namespace)']]], + ['norml2sqr_5f_324',['normL2Sqr_',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3f28624360bc484ef29d8a52f57535e8',1,'cv::hal::normL2Sqr_()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3f28624360bc484ef29d8a52f57535e8',1,'normL2Sqr_()(Global Namespace)']]], + ['normsigma0_325',['normSigma0',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a904e3883188ebdb89beefe6a4a965fa2',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['normsigma1_326',['normSigma1',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#ac4cff7f10381d5bdf53dd4e914850cee',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['normsum_327',['normSum',['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#a056af618dd50c4cf5766fd17b4ac9a47',1,'cv::CvHOGEvaluator']]], + ['normtype_328',['normType',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#a613c8ce6b5f9477398ad901fda9c3976',1,'cv::BFMatcher::normType'],['https://docs.opencv.org/4.2.0/d3/d59/structcv_1_1Hamming.html#af8cc9a994e3652df2cde602e3388fbe2',1,'cv::Hamming::normType'],['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1L1.html#ad89d6306fc5aa869cad4331829a81413',1,'cv::L1::normType'],['https://docs.opencv.org/4.2.0/dc/daa/structcv_1_1L2.html#a8e2183229c487c4bee384b5a013272ee',1,'cv::L2::normType'],['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html#af3f11374d301333b1e0cabf6bdb7a72b',1,'cv::SL2::normType']]], + ['normtypes_329',['NormTypes',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad12cefbcb5291cf958a85b4b67b6149f',1,'cv::NormTypes'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad12cefbcb5291cf958a85b4b67b6149f',1,'NormTypes(Global Namespace)']]], + ['normvariance_330',['normVariance',['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html#a5a238be2bd4942ede8ddd14a31f5fc2f',1,'cv::dnn::MVNLayer']]], + ['noseamfinder_331',['NoSeamFinder',['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1detail_1_1NoSeamFinder.html',1,'cv::detail']]], + ['noshowbase_332',['noshowbase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae40e0e6a5a4292cc070a737693bce4ab',1,'std']]], + ['noshowpoint_333',['noshowpoint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acacc67bedbef4625ffdf88d2b188a9f5',1,'std']]], + ['noshowpos_334',['noshowpos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab7219399afb34c97c7c439be76b2eb49',1,'std']]], + ['noskipws_335',['noskipws',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a371c82c535d8f1e6c245524313394a9a',1,'std']]], + ['nosubs_336',['nosubs',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a29777ae2dd2358f4faf29cb604c3fb85',1,'std::regex_constants']]], + ['not1_337',['not1',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14e6ff9917f324e7bee464664080ff11',1,'cv::cudev::not1()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14e6ff9917f324e7bee464664080ff11',1,'not1()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01509.html#gaa48ba7f453a3e4aec335c304eab89d3b',1,'std::not1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01509.html#gaa48ba7f453a3e4aec335c304eab89d3b',1,'not1()(Global Namespace)']]], + ['not2_338',['not2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabaa3c68534da21be33598016e13ed502',1,'cv::cudev::not2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabaa3c68534da21be33598016e13ed502',1,'not2()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01509.html#ga1244dfac05a74c4665bef243704f51b1',1,'std::not2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01509.html#ga1244dfac05a74c4665bef243704f51b1',1,'not2()(Global Namespace)']]], + ['not8u_339',['not8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabf1778785d2fa6835daa6ef4eec982d6',1,'cv::hal::not8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabf1778785d2fa6835daa6ef4eec982d6',1,'not8u()(Global Namespace)']]], + ['not_5fdraw_5fsingle_5flines_340',['NOT_DRAW_SINGLE_LINES',['https://docs.opencv.org/4.2.0/d8/d6f/structcv_1_1line__descriptor_1_1DrawLinesMatchesFlags.html#af77f9b45585f16821d7a06ea38909e68a5211a6d6db85969c518dedcfd810a901',1,'cv::line_descriptor::DrawLinesMatchesFlags']]], + ['not_5fdraw_5fsingle_5fpoints_341',['NOT_DRAW_SINGLE_POINTS',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a811ff9a659123ff7317ccd1269e59259',1,'NOT_DRAW_SINGLE_POINTS(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a811ff9a659123ff7317ccd1269e59259',1,'NOT_DRAW_SINGLE_POINTS(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a811ff9a659123ff7317ccd1269e59259',1,'NOT_DRAW_SINGLE_POINTS(Global Namespace)']]], + ['not_5fequal_5fto_342',['not_equal_to',['https://docs.opencv.org/4.2.0/df/d9f/structcv_1_1cudev_1_1not__equal__to.html',1,'cv::cudev::not_equal_to< T >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07407.html',1,'std::not_equal_to< class >']]], + ['not_5fequal_5fto_3c_20void_20_3e_343',['not_equal_to< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07447.html',1,'std']]], + ['not_5fset_344',['not_set',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#afa4c5b344cb1b57ccc5c50be8f563071',1,'cv::viz::Color']]], + ['notag_345',['NoTag',['https://docs.opencv.org/4.2.0/db/d4e/structcv_1_1detail_1_1NoTag.html',1,'cv::detail']]], + ['notifiable_346',['Notifiable',['../classutil_1_1impl_1_1Notifiable.html',1,'util::impl']]], + ['notify_347',['notify',['../classutil_1_1AsyncTask.html#aa3410b83c36ea34a1503ff6d61f093d7',1,'util::AsyncTask::notify()'],['../classutil_1_1PeriodicTask.html#ad060d682418dcce364fe2008b662cf2a',1,'util::PeriodicTask::notify()']]], + ['notify_5fcleared_348',['notify_cleared',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#afe7436bbd2219b3bb023834046574805',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_cleared()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11159.html#a4c92b235ca2dcda57fe3d4cee1afb48b',1,'__gnu_pbds::hash_load_check_resize_trigger::notify_cleared()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a05de88b76a627079b289c79e6211b2ff',1,'__gnu_pbds::sample_resize_policy::notify_cleared()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#ad71aeb3fd1e05e60f995c36e3d35767f',1,'__gnu_pbds::sample_resize_trigger::notify_cleared()']]], + ['notify_5ferase_5fsearch_5fcollision_349',['notify_erase_search_collision',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a751447ee7cf5a38825c91c46156f1553',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_erase_search_collision()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a4ffa318ca12b0f6e94025404d719dac6',1,'__gnu_pbds::sample_resize_policy::notify_erase_search_collision()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a088f748acb2a93d3bef0845f30817095',1,'__gnu_pbds::sample_resize_trigger::notify_erase_search_collision()']]], + ['notify_5ferase_5fsearch_5fend_350',['notify_erase_search_end',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#ad2553af559204a400e889dfce3793555',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_erase_search_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a422ecd561446279e732bdd769d0b3e4b',1,'__gnu_pbds::sample_resize_policy::notify_erase_search_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a0d557313c011b673d803dda8053708ef',1,'__gnu_pbds::sample_resize_trigger::notify_erase_search_end()']]], + ['notify_5ferase_5fsearch_5fstart_351',['notify_erase_search_start',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a240b4b28ea1cdc784d5e95c62db3c15f',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_erase_search_start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a5fd680a16511a80b749dd7822fa8f9bc',1,'__gnu_pbds::sample_resize_policy::notify_erase_search_start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a23ea236b72a1cf5c89554f61dcefc3e5',1,'__gnu_pbds::sample_resize_trigger::notify_erase_search_start()']]], + ['notify_5ferased_352',['notify_erased',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a1f46c2c9b293370318f1e2abb64cfcc1',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_erased()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#ab70b8dc8913637ca0f01d35b9773566e',1,'__gnu_pbds::sample_resize_policy::notify_erased()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a7bfcb5953beee28b074a8226acad55d5',1,'__gnu_pbds::sample_resize_trigger::notify_erased()']]], + ['notify_5fexternally_5fresized_353',['notify_externally_resized',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a548dc80e54ce98dfb63b6197b0a5367f',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_externally_resized()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#af2b8a2fbe273f91aaf149eaedecd56de',1,'__gnu_pbds::sample_resize_trigger::notify_externally_resized()']]], + ['notify_5ffind_5fsearch_5fcollision_354',['notify_find_search_collision',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#aa657361a797637c5894f887b2f68b08d',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_find_search_collision()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a5a06ce787b7413b6acb303828152ae7c',1,'__gnu_pbds::sample_resize_policy::notify_find_search_collision()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a9c0b640580ae2e181daabbf9957da8e7',1,'__gnu_pbds::sample_resize_trigger::notify_find_search_collision()']]], + ['notify_5ffind_5fsearch_5fend_355',['notify_find_search_end',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a495e2209b7f02d5006404aaaa1087768',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_find_search_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a835318af4e9e95601fc28a30c6bafa48',1,'__gnu_pbds::sample_resize_policy::notify_find_search_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#af0e3483a3dcb16e0be3f94f0affb2056',1,'__gnu_pbds::sample_resize_trigger::notify_find_search_end()']]], + ['notify_5ffind_5fsearch_5fstart_356',['notify_find_search_start',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#aecfd626845c5f41b5996a98ce41abe5d',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_find_search_start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a049a9b26e770f5856ba47127603952bf',1,'__gnu_pbds::sample_resize_policy::notify_find_search_start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#af384d9703a5ed2c0e7d2bc70889f659f',1,'__gnu_pbds::sample_resize_trigger::notify_find_search_start()']]], + ['notify_5finsert_5fsearch_5fcollision_357',['notify_insert_search_collision',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a0ada2bfdc28eb5b321d4e40ae1d383f1',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_insert_search_collision()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#aca8c593c0e90ebd7e9e76507f2a66681',1,'__gnu_pbds::sample_resize_policy::notify_insert_search_collision()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a2abd2edcc33007cf820628cb17fe98cb',1,'__gnu_pbds::sample_resize_trigger::notify_insert_search_collision()']]], + ['notify_5finsert_5fsearch_5fend_358',['notify_insert_search_end',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a64694cff7ecc080077cf5a1d77cfb91f',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_insert_search_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a324ce12091c2c37a6b0e8157b76ab63b',1,'__gnu_pbds::sample_resize_policy::notify_insert_search_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a126cd2bc9ea39c89a5dee38f9eaf5c38',1,'__gnu_pbds::sample_resize_trigger::notify_insert_search_end()']]], + ['notify_5finsert_5fsearch_5fstart_359',['notify_insert_search_start',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#ac180a1382d59cb873053ef1a00aeaf7a',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_insert_search_start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#af97f835b6224de469cefcf56c56af820',1,'__gnu_pbds::sample_resize_policy::notify_insert_search_start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a0f332904f1c430cb8a914b50cb1ec6c8',1,'__gnu_pbds::sample_resize_trigger::notify_insert_search_start()']]], + ['notify_5finserted_360',['notify_inserted',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a3873f31f2d3d3ff8118f48fa2bead1a8',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_inserted()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11159.html#a6389dcb57ad2dc82804a7dbf32d96fc8',1,'__gnu_pbds::hash_load_check_resize_trigger::notify_inserted()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#ad86ab0f36470d704ca8641b07717c1c7',1,'__gnu_pbds::sample_resize_policy::notify_inserted()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#af820554398c7ec86b22255c89e6aadfa',1,'__gnu_pbds::sample_resize_trigger::notify_inserted()']]], + ['notify_5fresized_361',['notify_resized',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a21c9dcb73448b7a0e82857a272ad43a8',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::notify_resized()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11159.html#a027d59f653ccc3272bb94540164bfd77',1,'__gnu_pbds::hash_load_check_resize_trigger::notify_resized()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11787.html#a1394c13061424917235d675059ae554e',1,'__gnu_pbds::sample_range_hashing::notify_resized()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11791.html#a60cf8f7475787a8828380db05189e452',1,'__gnu_pbds::sample_ranged_hash_fn::notify_resized()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#a1f8207b058608607c137773eef92679c',1,'__gnu_pbds::sample_resize_policy::notify_resized()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a21662c6d33a62336b1ed122cf717ff00',1,'__gnu_pbds::sample_resize_trigger::notify_resized()']]], + ['nounitbuf_362',['nounitbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a205c934d476ce13b62c74c1e1229e906',1,'std']]], + ['nouppercase_363',['nouppercase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0b1c781ecc10f910c74dd2ff27a1f2ae',1,'std']]], + ['nplanes_364',['nplanes',['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a94ba374a7e5a004d19060a522893e09d',1,'cv::NAryMatIterator']]], + ['npos_365',['npos',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a73ccdcfb7ba35398105c667960f1f9f8',1,'cv::CvFeatureEvaluator::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a8ae69d8d271de80c7989283cd34a1790',1,'__gnu_cxx::__versa_string::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'__gnu_debug::basic_string::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< _CharT >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< _CharT, _Traits, _Allocator >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< char >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< char, char_traits< char >, _Byte_alloc >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< char_type, _Traits, _Alloc >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< value_type >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'std::basic_string::npos']]], + ['npp_5fstaging_2ehpp_366',['NPP_staging.hpp',['https://docs.opencv.org/4.2.0/d5/d2c/NPP__staging_8hpp.html',1,'']]], + ['nppistdecimate_5f32f_5fc1r_367',['nppiStDecimate_32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga41653691e02f61bac1555628df1c9176',1,]]], + ['nppistdecimate_5f32f_5fc1r_5fhost_368',['nppiStDecimate_32f_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga4c06da37459c05da8c746a116c6b8a26',1,]]], + ['nppistdecimate_5f32s_5fc1r_369',['nppiStDecimate_32s_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga2f264c45b0a58ba1914d4da7f2d42729',1,]]], + ['nppistdecimate_5f32s_5fc1r_5fhost_370',['nppiStDecimate_32s_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga390d9ae987ab8986a476df3b2a6e563d',1,]]], + ['nppistdecimate_5f32u_5fc1r_371',['nppiStDecimate_32u_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gaf180ff84ab050091645b9747e059f582',1,]]], + ['nppistdecimate_5f32u_5fc1r_5fhost_372',['nppiStDecimate_32u_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga9e6782d12f3d60eb841b48d4f351eb0c',1,]]], + ['nppistdecimate_5f64f_5fc1r_373',['nppiStDecimate_64f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gaba8ac56503435b723a35cb541b4af2d8',1,]]], + ['nppistdecimate_5f64f_5fc1r_5fhost_374',['nppiStDecimate_64f_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga99f7ba921a703545275da77c60b9dcfa',1,]]], + ['nppistdecimate_5f64s_5fc1r_375',['nppiStDecimate_64s_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gaf107bae80aa121b57664057951f56155',1,]]], + ['nppistdecimate_5f64s_5fc1r_5fhost_376',['nppiStDecimate_64s_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga292a3b4a145ee6c7f4f0f995d42d09e9',1,]]], + ['nppistdecimate_5f64u_5fc1r_377',['nppiStDecimate_64u_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga02d494bfc76b4327fb6a730525a4ee7a',1,]]], + ['nppistdecimate_5f64u_5fc1r_5fhost_378',['nppiStDecimate_64u_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga6aebe497ce42cce998d6dfe02981a374',1,]]], + ['nppistfiltercolumnborder_5f32f_5fc1r_379',['nppiStFilterColumnBorder_32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga2fe3ed7981d4245d0bd7f63e94234948',1,]]], + ['nppistfilterrowborder_5f32f_5fc1r_380',['nppiStFilterRowBorder_32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga54f143dc33abad123cb6b14041f7cda5',1,]]], + ['nppistgetinterpolationbuffersize_381',['nppiStGetInterpolationBufferSize',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga105e268f9e92bf2795102720a2d03082',1,]]], + ['nppistintegral_5f32f32f_5fc1r_382',['nppiStIntegral_32f32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gad651eea1a106e926b46d9a578f982bd2',1,]]], + ['nppistintegral_5f32f32f_5fc1r_5fhost_383',['nppiStIntegral_32f32f_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gab4c8b8ff1c5ddac07b13250affde330c',1,]]], + ['nppistintegral_5f8u32u_5fc1r_384',['nppiStIntegral_8u32u_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga8d9fe449c1caacf9875c41d49dc864ec',1,]]], + ['nppistintegral_5f8u32u_5fc1r_5fhost_385',['nppiStIntegral_8u32u_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga4d98e56ebd905bd60210e1f26a1dc45f',1,]]], + ['nppistintegralgetsize_5f32f32f_386',['nppiStIntegralGetSize_32f32f',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga83a3047bd6d61467b192beb4bb17a00c',1,]]], + ['nppistintegralgetsize_5f8u32u_387',['nppiStIntegralGetSize_8u32u',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga91f663804d1664dacb1b4960113132bc',1,]]], + ['nppistinterpolateframes_388',['nppiStInterpolateFrames',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gaa1c83393b008cfda0a2ececc67f8e65d',1,]]], + ['nppistrectstddev_5f32f_5fc1r_389',['nppiStRectStdDev_32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga2bdca3cdf59ae4a68c2ce1cfec567c3c',1,]]], + ['nppistrectstddev_5f32f_5fc1r_5fhost_390',['nppiStRectStdDev_32f_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gae5ef85171ce1a561526b944ac529dc32',1,]]], + ['nppistresize_5f32f_5fc1r_391',['nppiStResize_32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga5e3319fdc5bf2807c4fa57d185cdbaa5',1,]]], + ['nppistsqrintegral_5f8u64u_5fc1r_392',['nppiStSqrIntegral_8u64u_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga752b7fb369792ade2873233dc5e544f1',1,]]], + ['nppistsqrintegral_5f8u64u_5fc1r_5fhost_393',['nppiStSqrIntegral_8u64u_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga1c5bde72920da90b07bd6cb1793e3ecc',1,]]], + ['nppistsqrintegralgetsize_5f8u64u_394',['nppiStSqrIntegralGetSize_8u64u',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga4e0f56a59a0ccbd45826edd4b25ea40b',1,]]], + ['nppisttranspose_5f128_5fc1r_395',['nppiStTranspose_128_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga06ca25fa65ae93754dc078c2200071a3',1,]]], + ['nppisttranspose_5f128_5fc1r_5fhost_396',['nppiStTranspose_128_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga13a2a25e90a3d6c91a6eea236efdc4a6',1,]]], + ['nppisttranspose_5f32f_5fc1r_397',['nppiStTranspose_32f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga135742eb612a7cc0e4a12b0b7f128d3a',1,]]], + ['nppisttranspose_5f32f_5fc1r_5fhost_398',['nppiStTranspose_32f_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga01395679caf9a5a52c418ea7eddc4feb',1,]]], + ['nppisttranspose_5f32s_5fc1r_399',['nppiStTranspose_32s_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga2a3fe0595d83469325c6f5edf46e012b',1,]]], + ['nppisttranspose_5f32s_5fc1r_5fhost_400',['nppiStTranspose_32s_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga342e4f4fccc1f5c1514d912112b263ee',1,]]], + ['nppisttranspose_5f32u_5fc1r_401',['nppiStTranspose_32u_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gad7ba74e6d2fc65c0d5e3c8d8eb5b748a',1,]]], + ['nppisttranspose_5f32u_5fc1r_5fhost_402',['nppiStTranspose_32u_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga7dea5337b2f97142ef2b2359def09245',1,]]], + ['nppisttranspose_5f64f_5fc1r_403',['nppiStTranspose_64f_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga3eb1ea72683f5096a3ae1b92cb366e79',1,]]], + ['nppisttranspose_5f64f_5fc1r_5fhost_404',['nppiStTranspose_64f_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga8af00cbb989165d71e369940369abd0b',1,]]], + ['nppisttranspose_5f64s_5fc1r_405',['nppiStTranspose_64s_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gac2523729dffe2f9254d091835bdf0e37',1,]]], + ['nppisttranspose_5f64s_5fc1r_5fhost_406',['nppiStTranspose_64s_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga230fcc284efd87a1a9675de223961fe2',1,]]], + ['nppisttranspose_5f64u_5fc1r_407',['nppiStTranspose_64u_C1R',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga779ad91eedf3b75e1ea9b03a0e7a2a14',1,]]], + ['nppisttranspose_5f64u_5fc1r_5fhost_408',['nppiStTranspose_64u_C1R_host',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gaef5ac7d73a8615562d90a777e098c53d',1,]]], + ['nppistvectorwarp_5fpsf1x1_5f32f_5fc1_409',['nppiStVectorWarp_PSF1x1_32f_C1',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga262306275af47e2cfa3de1dd06cea5a1',1,]]], + ['nppistvectorwarp_5fpsf2x2_5f32f_5fc1_410',['nppiStVectorWarp_PSF2x2_32f_C1',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gaf5bfc308f7f77d33a424ca53164ad3a6',1,]]], + ['nppistvectorwarpgetbuffersize_411',['nppiStVectorWarpGetBufferSize',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga641c538764b924048fed9cac8eee63a3',1,]]], + ['nppsstcompact_5f32f_412',['nppsStCompact_32f',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga440ba655fd72979cbffee797cfeaaec0',1,]]], + ['nppsstcompact_5f32f_5fhost_413',['nppsStCompact_32f_host',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#gad17df26ff439981ea24dd4fad8334ed3',1,]]], + ['nppsstcompact_5f32s_414',['nppsStCompact_32s',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga338be6eb29e6ad3835d5128414077ef6',1,]]], + ['nppsstcompact_5f32s_5fhost_415',['nppsStCompact_32s_host',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga0bc23f35382c9609c449c94503a08a4d',1,]]], + ['nppsstcompact_5f32u_416',['nppsStCompact_32u',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga8affd8f556e07d9b10c150fb98d40364',1,]]], + ['nppsstcompact_5f32u_5fhost_417',['nppsStCompact_32u_host',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#gaea57bb241aac5e10d4fdac6b30655e26',1,]]], + ['nppsstcompactgetsize_5f32f_418',['nppsStCompactGetSize_32f',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga815868ea68f1cf070de75ead6b4793a9',1,]]], + ['nppsstcompactgetsize_5f32s_419',['nppsStCompactGetSize_32s',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga500430cc2130b1ab6cff9beabf8b5174',1,]]], + ['nppsstcompactgetsize_5f32u_420',['nppsStCompactGetSize_32u',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html#ga82852a492d20ab7ec1a706a315642f4e',1,]]], + ['nppst_20core_421',['NPPST Core',['https://docs.opencv.org/4.2.0/d5/ddd/group__core__npp.html',1,'']]], + ['nppst_20image_20processing_422',['NPPST Image Processing',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html',1,'']]], + ['nppst_20signal_20processing_423',['NPPST Signal Processing',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html',1,'']]], + ['nppst_5fcuda_5fkernel_5fexecution_5ferror_424',['NPPST_CUDA_KERNEL_EXECUTION_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a1485d49bcf34f4c8b9f26c2bae91ddc1',1,]]], + ['nppst_5ferror_425',['NPPST_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a423ee15b09c37f3a321fd0bb21379bb6',1,]]], + ['nppst_5finvalid_5froi_426',['NPPST_INVALID_ROI',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a33d1cdb1e0f69dc1eb4f5fe757794b0d',1,]]], + ['nppst_5finvalid_5fscale_427',['NPPST_INVALID_SCALE',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a5ef8a814660ade7442f3210368053686',1,]]], + ['nppst_5finvalid_5fstep_428',['NPPST_INVALID_STEP',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a313998ae688b9029f142f5bdfcda25e5',1,]]], + ['nppst_5fmem_5falloc_5ferr_429',['NPPST_MEM_ALLOC_ERR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a76678bd4071693de989b0c2b2971743e',1,]]], + ['nppst_5fmem_5finsufficient_5fbuffer_430',['NPPST_MEM_INSUFFICIENT_BUFFER',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725ac54252ecacba9ac29a8c8adf7787b7f4',1,]]], + ['nppst_5fmem_5finternal_5ferror_431',['NPPST_MEM_INTERNAL_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a69e3ac9796227461e2905630ad6152ce',1,]]], + ['nppst_5fmem_5fresidence_5ferror_432',['NPPST_MEM_RESIDENCE_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a89345ff6d17cbc2332c28b0b7f3a76ea',1,]]], + ['nppst_5fmemcpy_5ferror_433',['NPPST_MEMCPY_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a0fe175e4bae1e6c7a4fb220f42ff5e8f',1,]]], + ['nppst_5fmemfree_5ferr_434',['NPPST_MEMFREE_ERR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725af789d1385b3a4255b8c3e9322b21b3e2',1,]]], + ['nppst_5fnull_5fpointer_5ferror_435',['NPPST_NULL_POINTER_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a884e059b099f673fed83fec389b57289',1,]]], + ['nppst_5fsuccess_436',['NPPST_SUCCESS',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a60e77b014292362309dfc3ad536dc902',1,]]], + ['nppst_5ftexture_5fbind_5ferror_437',['NPPST_TEXTURE_BIND_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725aa160fb71a0d8bf914b4c5f6e6dd8f8a8',1,]]], + ['nppstbicubic_438',['nppStBicubic',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga0bfe03940f062d1a975f748a6ce9357da94c62fb3d22fb953e0769fc76b1bada2',1,]]], + ['nppstborderclamp_439',['nppStBorderClamp',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca54290d1cd5b3edc8d08fddf44a7b1d49',1,]]], + ['nppstbordermirror_440',['nppStBorderMirror',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca40998ebdca4e7972fa1649302b6a5793',1,]]], + ['nppstbordernone_441',['nppStBorderNone',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca84b1bfe04b1ff2cf60fcf67746e1eb48',1,]]], + ['nppstbordertype_442',['NppStBorderType',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga8b115979ee872d8e356c2f1f162d483c',1,]]], + ['nppstborderwrap_443',['nppStBorderWrap',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca00581d73e23c3cfa12ed297ad65342a1',1,]]], + ['nppstgetactivecudastream_444',['nppStGetActiveCUDAstream',['https://docs.opencv.org/4.2.0/d5/ddd/group__core__npp.html#ga97288d29b9fa9147b21cdcfcf4549e3b',1,]]], + ['nppstinterpmode_445',['NppStInterpMode',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#ga0bfe03940f062d1a975f748a6ce9357d',1,]]], + ['nppstinterpolationstate_446',['NppStInterpolationState',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html',1,'']]], + ['nppstsetactivecudastream_447',['nppStSetActiveCUDAstream',['https://docs.opencv.org/4.2.0/d5/ddd/group__core__npp.html#gae7bf7a1fddf4185a8f99a5617be3369a',1,]]], + ['nppstsupersample_448',['nppStSupersample',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga0bfe03940f062d1a975f748a6ce9357da712e2f6fc4e4a9d5d34c9cde78418e29',1,]]], + ['nrm_5ffull_449',['NRM_FULL',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151abcce140638cce986270b7d280fbc0cf8',1,'cv::xfeatures2d::DAISY']]], + ['nrm_5fnone_450',['NRM_NONE',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151a7c15db095b13e2ab1e13b292e201d259',1,'cv::xfeatures2d::DAISY']]], + ['nrm_5fpartial_451',['NRM_PARTIAL',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151a228d8972f227e53b7b1ffaddb979f55b',1,'cv::xfeatures2d::DAISY']]], + ['nrm_5fsift_452',['NRM_SIFT',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151a07e3a3513ec8b0d3b333cdb7ba964fca',1,'cv::xfeatures2d::DAISY']]], + ['nsobject_453',['NSObject',['https://docs.opencv.org/4.2.0/d4/d19/classNSObject.html',1,'']]], + ['nsobject_2dp_2dp_454',['NSObject-p-p',['https://docs.opencv.org/4.2.0/d9/d15/classNSObject-p.html',1,'']]], + ['nsobjectnsobject_2dp_2dp_455',['NSObjectNSObject-p-p',['https://docs.opencv.org/4.2.0/d5/d25/classNSObjectNSObject-p.html',1,'']]], + ['nstep_456',['nStep',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a6b2b89fd8ad1ef76a08b088a100a1673',1,'NppStInterpolationState']]], + ['nth_5felement_457',['nth_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a4f2ca9c1c627576aeeaa99181c8c63',1,'std::nth_element(_RandomAccessIterator __first, _RandomAccessIterator __nth, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6d43f0d62204409f18762c8e1bf1867b',1,'std::nth_element(_RandomAccessIterator __first, _RandomAccessIterator __nth, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a4f2ca9c1c627576aeeaa99181c8c63',1,'nth_element(_RandomAccessIterator __first, _RandomAccessIterator __nth, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6d43f0d62204409f18762c8e1bf1867b',1,'nth_element(_RandomAccessIterator __first, _RandomAccessIterator __nth, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], + ['nth_5felement_5fminimal_5fn_458',['nth_element_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a34bef940cd171e22210e1c349152aab9',1,'__gnu_parallel::_Settings']]], + ['nu_459',['NU',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3ae0c1409f55f0158101fcc5e07f095605',1,'cv::ml::SVM']]], + ['nu02_460',['nu02',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ad15583ebb8f3b85acfb55442a6b8c533',1,'cv::Moments']]], + ['nu03_461',['nu03',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a1b5f0e8a3df615e6bb16f6cd89b9a646',1,'cv::Moments']]], + ['nu11_462',['nu11',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ade4cfa48ff5d25d8f24c789282163aa5',1,'cv::Moments']]], + ['nu12_463',['nu12',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ad0cdde3c12b9bf65a97da0d2e7e65e98',1,'cv::Moments']]], + ['nu20_464',['nu20',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a60e0eda02ec9ed4646673bd2b6b72545',1,'cv::Moments']]], + ['nu21_465',['nu21',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a429e531e475a2619195c4787c4992a62',1,'cv::Moments']]], + ['nu30_466',['nu30',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a223d272dc5ec3efe401d6dd1c4fb3087',1,'cv::Moments']]], + ['nu_5fsvc_467',['NU_SVC',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa50c44a78c88f3cde09599fba4347134d',1,'cv::ml::SVM']]], + ['nu_5fsvr_468',['NU_SVR',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa5b4b7e4b189d47be1765b3c6b19f6c80',1,'cv::ml::SVM']]], + ['null_469',['Null',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a680af5adfeeb1cdaa5b7b13f680c0131',1,'cv::cuda::Stream']]], + ['null_470',['null',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a0ad26edef3f8d530dcec3192bba82df6.html#a0ad26edef3f8d530dcec3192bba82df6',1,'nlohmann::json_sax']]], + ['null_5fnode_5fmetadata_2ehpp_471',['null_node_metadata.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01238.html',1,'']]], + ['null_5fnode_5fupdate_472',['null_node_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11295.html',1,'__gnu_pbds']]], + ['null_5ftype_473',['null_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11291.html',1,'__gnu_pbds']]], + ['nullary_20expressions_474',['Matrix manipulation via nullary-expressions',['https://eigen.tuxfamily.org/dox/TopicCustomizing_NullaryExpr.html',1,'']]], + ['nullaryexpr_475',['NullaryExpr',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5dc65501accd02c30f7c1840c2a30a41',1,'Eigen::DenseBase::NullaryExpr(const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3340c9b997f5b53a0131cf927f93b54c',1,'Eigen::DenseBase::NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9752ee59976a4b4aad860ad1a9093e7f',1,'Eigen::DenseBase::NullaryExpr(Index size, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5dc65501accd02c30f7c1840c2a30a41',1,'DenseBase< ArrayWrapper< ExpressionType > >::NullaryExpr(const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3340c9b997f5b53a0131cf927f93b54c',1,'DenseBase< ArrayWrapper< ExpressionType > >::NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9752ee59976a4b4aad860ad1a9093e7f',1,'DenseBase< ArrayWrapper< ExpressionType > >::NullaryExpr(Index size, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5dc65501accd02c30f7c1840c2a30a41',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NullaryExpr(const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3340c9b997f5b53a0131cf927f93b54c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9752ee59976a4b4aad860ad1a9093e7f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NullaryExpr(Index size, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5dc65501accd02c30f7c1840c2a30a41',1,'DenseBase< Solve< Decomposition, RhsType > >::NullaryExpr(const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3340c9b997f5b53a0131cf927f93b54c',1,'DenseBase< Solve< Decomposition, RhsType > >::NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9752ee59976a4b4aad860ad1a9093e7f',1,'DenseBase< Solve< Decomposition, RhsType > >::NullaryExpr(Index size, const CustomNullaryOp &func)']]], + ['nulldeblurer_476',['NullDeblurer',['https://docs.opencv.org/4.2.0/dc/d86/classcv_1_1videostab_1_1NullDeblurer.html',1,'cv::videostab']]], + ['nullframesource_477',['NullFrameSource',['https://docs.opencv.org/4.2.0/dd/d5b/classcv_1_1videostab_1_1NullFrameSource.html',1,'cv::videostab']]], + ['nullinpainter_478',['NullInpainter',['https://docs.opencv.org/4.2.0/d4/d1d/classcv_1_1videostab_1_1NullInpainter.html',1,'cv::videostab']]], + ['nulllog_479',['NullLog',['https://docs.opencv.org/4.2.0/d6/d78/classcv_1_1videostab_1_1NullLog.html',1,'cv::videostab']]], + ['nullopt_480',['nullopt',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html#ga2221e221b29838a39e88d176b5859900',1,]]], + ['nullopt_5ft_481',['nullopt_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10079.html',1,'std::experimental::fundamentals_v1']]], + ['nulloutlierrejector_482',['NullOutlierRejector',['https://docs.opencv.org/4.2.0/d3/de9/classcv_1_1videostab_1_1NullOutlierRejector.html',1,'cv::videostab']]], + ['nulltype_483',['NullType',['https://docs.opencv.org/4.2.0/d5/d71/structcv_1_1cudev_1_1NullType.html',1,'cv::cudev']]], + ['nullwobblesuppressor_484',['NullWobbleSuppressor',['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1videostab_1_1NullWobbleSuppressor.html',1,'cv::videostab']]], + ['num_5fblocks_485',['num_blocks',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a8c8aff43771b4a33d923ce0e7b952540',1,'std::tr2::dynamic_bitset']]], + ['num_5fchildren_486',['num_children',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a78db74c5de3cfff1de97561e5d530147',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::num_children()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a78db74c5de3cfff1de97561e5d530147',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::num_children()']]], + ['num_5ferrs_5fper_5fmeasurement_5f_487',['num_errs_per_measurement_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a316c5f7ee2a86061f1aab7169aa78bac',1,'cv::detail::BundleAdjusterBase']]], + ['num_5ffeatures_488',['num_features',['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a4953b74f4c9c06fbd4fe5419f8b5a546',1,'cv::linemod::ColorGradient::num_features'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a7eaa7bd397f3f797c1ba05eb6c068ca9',1,'cv::linemod::DepthNormal::num_features']]], + ['num_5fget_489',['num_get',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html',1,'std::num_get< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a074eb427906209a5fbfa7f069ede6b6b',1,'std::num_get::num_get()']]], + ['num_5fhog_5fchannels_5fused_490',['num_hog_channels_used',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#aa96bc7c04e832dd5e5e57fe3270dc40a',1,'cv::TrackerCSRT::Params']]], + ['num_5fimages_5f_491',['num_images_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a195a4414e1e513a21ad1290cafb2c455',1,'cv::detail::BundleAdjusterBase']]], + ['num_5fin_492',['num_in',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#a75f7bf27319d7cc4be75276b2e2ed861',1,'cv::gapi::ie::detail::ParamDesc']]], + ['num_5finflexion_5fpoints_493',['num_inflexion_points',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a2b1f8919722218f49ae86bc00c48721e',1,'cv::text::ERStat']]], + ['num_5finliers_494',['num_inliers',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#a905005225c80c0b865e44508189634b8',1,'cv::detail::MatchesInfo']]], + ['num_5fmatches_5fthresh1_5f_495',['num_matches_thresh1_',['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#a9feea2b5ac622dcacf9eba2f5a27dafd',1,'cv::detail::BestOf2NearestMatcher']]], + ['num_5fmatches_5fthresh2_5f_496',['num_matches_thresh2_',['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#ad1395b7d534b402b215519b6e9ac8bd9',1,'cv::detail::BestOf2NearestMatcher']]], + ['num_5fout_497',['num_out',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#a91fcee8a7d169d5e0785458c7fb8219f',1,'cv::gapi::ie::detail::ParamDesc']]], + ['num_5fparams_5fper_5fcam_5f_498',['num_params_per_cam_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a53a2fe05702415fbf2926179032c727b',1,'cv::detail::BundleAdjusterBase']]], + ['num_5fput_499',['num_put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html',1,'std::num_put< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a8c248a63cf9ad3dcf26f93f1b1b75d9c',1,'std::num_put::num_put()']]], + ['num_5fref_5fpoints_500',['num_ref_points',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a5aa5adb0a18007b213fb09852f24687c',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['num_5fsplit_501',['num_split',['https://docs.opencv.org/4.2.0/de/d61/classcv_1_1dnn_1_1SliceLayer.html#a97107f7a9f903380576952c526f0425c',1,'cv::dnn::SliceLayer']]], + ['num_5ftest_5fcoordinates_502',['num_test_coordinates',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a154ffe1d90e20d6d940900a682ad3875',1,'cv::face::FacemarkKazemi::Params']]], + ['num_5ftest_5fsplits_503',['num_test_splits',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a148be99b10aac689210a4e42e8fa6cd6',1,'cv::face::FacemarkKazemi::Params']]], + ['num_5ftrees_5fper_5fcascade_5flevel_504',['num_trees_per_cascade_level',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#ad26da85380c6dc4a7f3e27934fb174e1',1,'cv::face::FacemarkKazemi::Params']]], + ['numbands_505',['numBands',['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html#a150b2708c084e00b107fcc42d0298e98',1,'cv::detail::MultiBandBlender']]], + ['number_20distributions_506',['Random Number Distributions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01542.html',1,'']]], + ['number_20generation_507',['Random Number Generation',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01500.html',1,'']]], + ['number_20generators_508',['Random Number Generators',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html',1,'']]], + ['number_20utilities_509',['Random Number Utilities',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01547.html',1,'']]], + ['number_5ffloat_510',['number_float',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_ae7c31614e8a82164d2d7f8dbf4671b25.html#ae7c31614e8a82164d2d7f8dbf4671b25',1,'nlohmann::json_sax']]], + ['number_5ffloat_5ft_511',['number_float_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5b8abaebd922d82d69756327c0c347e6.html#a5b8abaebd922d82d69756327c0c347e6',1,'nlohmann::basic_json::number_float_t'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a390c209bffd8c4800c8f3076dc465a20.html#a390c209bffd8c4800c8f3076dc465a20',1,'nlohmann::json_sax::number_float_t']]], + ['number_5finteger_512',['number_integer',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_affa7a78b8e9cc9cc3ac99927143142a5.html#affa7a78b8e9cc9cc3ac99927143142a5',1,'nlohmann::json_sax']]], + ['number_5finteger_5ft_513',['number_integer_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a11e390944da90db83089eb2426a749d3.html#a11e390944da90db83089eb2426a749d3',1,'nlohmann::basic_json::number_integer_t'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a0cef30121f02b7fee85e9708148ea0aa.html#a0cef30121f02b7fee85e9708148ea0aa',1,'nlohmann::json_sax::number_integer_t']]], + ['number_5fof_5finner_5fiterations_514',['number_of_inner_iterations',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#a4d4ccb8be909ebdecaa392ee27324a9f',1,'NCVBroxOpticalFlowDescriptor']]], + ['number_5fof_5fouter_5fiterations_515',['number_of_outer_iterations',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#a53fdc567ae0d0b5aeb05f8dd8105f518',1,'NCVBroxOpticalFlowDescriptor']]], + ['number_5fof_5fscales_516',['number_of_scales',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#ad08546bf074b482ed819a528e9c4aa8d',1,'cv::TrackerCSRT::Params']]], + ['number_5fof_5fsolver_5fiterations_517',['number_of_solver_iterations',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#aacbc235d882971d08e1e1c52b0e8d200',1,'NCVBroxOpticalFlowDescriptor']]], + ['number_5funsigned_518',['number_unsigned',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_ad9b253083e0509923ba195136f49face.html#ad9b253083e0509923ba195136f49face',1,'nlohmann::json_sax']]], + ['number_5funsigned_5ft_519',['number_unsigned_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ae09af9c23351b7245d9be4d1b2035fef.html#ae09af9c23351b7245d9be4d1b2035fef',1,'nlohmann::basic_json::number_unsigned_t'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a32028cc056ae0f43aaae331cdbbbf856.html#a32028cc056ae0f43aaae331cdbbbf856',1,'nlohmann::json_sax::number_unsigned_t']]], + ['numbers_520',['Complex Numbers',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html',1,'']]], + ['numclasses_521',['numClasses',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#acd7e2e72ced11b7338e127baf5654968',1,'cv::linemod::Detector']]], + ['numclassifierrootnodes_522',['NumClassifierRootNodes',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#ad3a96f77c2a3fd3377d38344970eadb5',1,'HaarClassifierCascadeDescriptor']]], + ['numclassifiers_523',['numClassifiers',['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#af5ca5c19ee7883c7d3a7ada6385dbcfc',1,'cv::TrackerBoosting::Params']]], + ['numclassifiertotalnodes_524',['NumClassifierTotalNodes',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#ac06d944bc6beabe293f6e9ef9b928e82',1,'HaarClassifierCascadeDescriptor']]], + ['numcodecs_525',['NumCodecs',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a53004f410b4576c429f9b82b34d0bc89',1,'cv::cudacodec::NumCodecs'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a53004f410b4576c429f9b82b34d0bc89',1,'NumCodecs(Global Namespace)']]], + ['numdetectedframes_526',['numDetectedFrames',['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#a6dee9fbd7cfda3cd478bf228c4ae4ef5',1,'cv::DetectionBasedTracker::TrackedObject']]], + ['numdimensions_527',['NumDimensions',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'Eigen::DenseBase::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'DenseBase< ArrayWrapper< ExpressionType > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'DenseBase< Solve< Decomposition, RhsType > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'Eigen::SparseMatrixBase::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< Transpose< MatrixType > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::NumDimensions']]], + ['numeric_528',['Numeric',['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html',1,'']]], + ['numeric_529',['numeric',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00113.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a50c9f58112ca40d3d53b07e1d524228b',1,'std::locale::numeric']]], + ['numeric_20arrays_530',['Numeric Arrays',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html',1,'']]], + ['numeric_20operations_531',['Generalized Numeric operations',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html',1,'']]], + ['numeric_2ehpp_532',['numeric.hpp',['https://docs.opencv.org/4.2.0/de/dd5/numeric_8hpp.html',1,'']]], + ['numeric_5flimits_533',['numeric_limits',['https://docs.opencv.org/4.2.0/db/dc8/structcv_1_1cudev_1_1numeric__limits.html',1,'cv::cudev::numeric_limits< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html',1,'std::numeric_limits< class >']]], + ['numeric_5flimits_3c_20bool_20_3e_534',['numeric_limits< bool >',['https://docs.opencv.org/4.2.0/da/d81/structcv_1_1cudev_1_1numeric__limits_3_01bool_01_4.html',1,'cv::cudev::numeric_limits< bool >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02535.html',1,'std::numeric_limits< bool >']]], + ['numeric_5flimits_3c_20char_20_3e_535',['numeric_limits< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02539.html',1,'std']]], + ['numeric_5flimits_3c_20char16_5ft_20_3e_536',['numeric_limits< char16_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02555.html',1,'std']]], + ['numeric_5flimits_3c_20char32_5ft_20_3e_537',['numeric_limits< char32_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02559.html',1,'std']]], + ['numeric_5flimits_3c_20double_20_3e_538',['numeric_limits< double >',['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html',1,'cv::cudev::numeric_limits< double >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02599.html',1,'std::numeric_limits< double >']]], + ['numeric_5flimits_3c_20float_20_3e_539',['numeric_limits< float >',['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html',1,'cv::cudev::numeric_limits< float >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02595.html',1,'std::numeric_limits< float >']]], + ['numeric_5flimits_3c_20int_20_3e_540',['numeric_limits< int >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02571.html',1,'std']]], + ['numeric_5flimits_3c_20long_20_3e_541',['numeric_limits< long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02579.html',1,'std']]], + ['numeric_5flimits_3c_20long_20double_20_3e_542',['numeric_limits< long double >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02603.html',1,'std']]], + ['numeric_5flimits_3c_20long_20long_20_3e_543',['numeric_limits< long long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02587.html',1,'std']]], + ['numeric_5flimits_3c_20schar_20_3e_544',['numeric_limits< schar >',['https://docs.opencv.org/4.2.0/da/d4e/structcv_1_1cudev_1_1numeric__limits_3_01schar_01_4.html',1,'cv::cudev']]], + ['numeric_5flimits_3c_20short_20_3e_545',['numeric_limits< short >',['https://docs.opencv.org/4.2.0/d1/d8b/structcv_1_1cudev_1_1numeric__limits_3_01short_01_4.html',1,'cv::cudev::numeric_limits< short >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02563.html',1,'std::numeric_limits< short >']]], + ['numeric_5flimits_3c_20signed_20char_20_3e_546',['numeric_limits< signed char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02543.html',1,'std']]], + ['numeric_5flimits_3c_20uchar_20_3e_547',['numeric_limits< uchar >',['https://docs.opencv.org/4.2.0/d3/dc7/structcv_1_1cudev_1_1numeric__limits_3_01uchar_01_4.html',1,'cv::cudev']]], + ['numeric_5flimits_3c_20uint_20_3e_548',['numeric_limits< uint >',['https://docs.opencv.org/4.2.0/dd/d89/structcv_1_1cudev_1_1numeric__limits_3_01uint_01_4.html',1,'cv::cudev']]], + ['numeric_5flimits_3c_20unsigned_20char_20_3e_549',['numeric_limits< unsigned char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02547.html',1,'std']]], + ['numeric_5flimits_3c_20unsigned_20int_20_3e_550',['numeric_limits< unsigned int >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02575.html',1,'std']]], + ['numeric_5flimits_3c_20unsigned_20long_20_3e_551',['numeric_limits< unsigned long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02583.html',1,'std']]], + ['numeric_5flimits_3c_20unsigned_20long_20long_20_3e_552',['numeric_limits< unsigned long long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02591.html',1,'std']]], + ['numeric_5flimits_3c_20unsigned_20short_20_3e_553',['numeric_limits< unsigned short >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02567.html',1,'std']]], + ['numeric_5flimits_3c_20ushort_20_3e_554',['numeric_limits< ushort >',['https://docs.opencv.org/4.2.0/df/d47/structcv_1_1cudev_1_1numeric__limits_3_01ushort_01_4.html',1,'cv::cudev']]], + ['numeric_5flimits_3c_20wchar_5ft_20_3e_555',['numeric_limits< wchar_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02551.html',1,'std']]], + ['numeric_5ftraits_2eh_556',['numeric_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01064.html',1,'']]], + ['numericalissue_557',['NumericalIssue',['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea1c6e20706575a629b27a105f07f1883b',1,'Eigen::NumericalIssue'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea1c6e20706575a629b27a105f07f1883b',1,'NumericalIssue(Global Namespace)']]], + ['numericaljacobian_558',['numericalJacobian',['../namespaceutil.html#a7e9d28b43adad26f05fd6a983e53b032',1,'util']]], + ['numericfwd_2eh_559',['numericfwd.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00929.html',1,'']]], + ['numerics_560',['Numerics',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01482.html',1,'']]], + ['numfeatures_561',['NumFeatures',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#a21bd5b9e52ecfb00ddbec3bd88df65cb',1,'HaarClassifierCascadeDescriptor']]], + ['numfeatures_562',['numFeatures',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a07f6d9031861da09df711cfc5d6d4d5b',1,'cv::CvFeatureEvaluator::numFeatures'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#ab7eb8578a2e582d6acac9db71ab69fcc',1,'cv::CvFeatureParams::numFeatures'],['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html#a540d5f029fbf504751a4ea99f55c9fe5',1,'cv::TrackerFeatureHAAR::Params::numFeatures']]], + ['numformats_563',['NumFormats',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga1887af7daca9ccca0f51f90bc8777280a1ce1da9c8116af9a854e89c357cefd05',1,'cv::cudacodec::NumFormats'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga1887af7daca9ccca0f51f90bc8777280a1ce1da9c8116af9a854e89c357cefd05',1,'NumFormats(Global Namespace)']]], + ['numframes_564',['numFrames',['https://docs.opencv.org/4.2.0/d3/dad/structcv_1_1datasets_1_1GR__chalearnObj.html#a5de85d16d4b55bb7ba094c2cb6d94b15',1,'cv::datasets::GR_chalearnObj']]], + ['numframesnotdetected_565',['numFramesNotDetected',['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#a04b096c1a1a334b1aae3300fb7336d32',1,'cv::DetectionBasedTracker::TrackedObject']]], + ['numiterperscale_5f_566',['numIterPerScale_',['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html#a36d93786fcb2fe4599389ab3aac7e786',1,'cv::reg::MapperPyramid']]], + ['numlastpositionstotrack_567',['numLastPositionsToTrack',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a2a58d6c53d4e525c891ec89a92df436b',1,'cv::DetectionBasedTracker::InnerParameters']]], + ['numlev_5f_568',['numLev_',['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html#a19463232045102b4ff85d05444104c49',1,'cv::reg::MapperPyramid']]], + ['numofoctave_5f_569',['numOfOctave_',['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#a5031b4c8286e96254ff46ca872fe4008',1,'cv::line_descriptor::BinaryDescriptor::Params']]], + ['numofpixels_570',['numOfPixels',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a5ef7fe33dd5d4096e679148c50bdb64e',1,'cv::line_descriptor::KeyLine']]], + ['numoutput_571',['numOutput',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html#af5a8966504dc3dcf40894731fc899b1d',1,'cv::dnn::BaseConvolutionLayer']]], + ['numpunct_572',['numpunct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html',1,'std::numpunct< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#ab735f1fdfc597150f2cb2619735d75bb',1,'std::numpunct::numpunct(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a14c5c77559d8e42b3bf279f9508232db',1,'std::numpunct::numpunct(__cache_type *__cache, size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aea7df1e8fe9c7bd9969e92c5efd2e3e0',1,'std::numpunct::numpunct(__c_locale __cloc, size_t __refs=0)']]], + ['numpunct_5fbyname_573',['numpunct_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05955.html',1,'std']]], + ['numstages_574',['NumStages',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#a95d5c1f21f7e1474ca8ec409373229d2',1,'HaarClassifierCascadeDescriptor']]], + ['numstepstoshowwithoutdetecting_575',['numStepsToShowWithoutDetecting',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a102b08d61404b141e997e8bd0370d753',1,'cv::DetectionBasedTracker::InnerParameters']]], + ['numstepstotrackwithoutdetectingifobjecthasnotbeenshown_576',['numStepsToTrackWithoutDetectingIfObjectHasNotBeenShown',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#ab606d5b2e44d0f8f06d79ae26fc21906',1,'cv::DetectionBasedTracker::InnerParameters']]], + ['numstepstowaitbeforefirstshow_577',['numStepsToWaitBeforeFirstShow',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a8ab7c8d16dc319344fbe1cd8983e347f',1,'cv::DetectionBasedTracker::InnerParameters']]], + ['numtemplates_578',['numTemplates',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a0838546464e172e3e57cfc5cd1cac98f',1,'cv::linemod::Detector::numTemplates() const'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#ad4ee440463a0c2214f830ea12fa4f4bd',1,'cv::linemod::Detector::numTemplates(const String &class_id) const']]], + ['numtrackedsteps_579',['numTrackedSteps',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#adb616a0b54da056cc7ee96963bba52e3',1,'cv::DetectionBasedTracker']]], + ['numtraits_580',['NumTraits',['https://eigen.tuxfamily.org/dox/structEigen_1_1NumTraits.html',1,'Eigen']]], + ['numtraits_3c_20scalar_20_3e_581',['NumTraits< Scalar >',['https://eigen.tuxfamily.org/dox/structEigen_1_1NumTraits.html',1,'']]], + ['numtraits_3c_20typename_20matrixtype_3a_3ascalar_20_3e_582',['NumTraits< typename MatrixType::Scalar >',['https://eigen.tuxfamily.org/dox/structEigen_1_1NumTraits.html',1,'']]], + ['numvertices_583',['numVertices',['https://docs.opencv.org/4.2.0/dc/d4c/classcv_1_1detail_1_1Graph.html#a8f71b977899774233d495be13a3d400b',1,'cv::detail::Graph']]], + ['numvotes_584',['numVotes',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#adeedb890c88c752e80f3d36a24ff2d3b',1,'cv::ppf_match_3d::Pose3D::numVotes'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#ac2708187fcdf45ae3ff3df2d54c3f48a',1,'cv::ppf_match_3d::PoseCluster3D::numVotes']]], + ['nv12tobgr_585',['NV12toBGR',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga26fa592432479d54a56e66227f818d7c',1,'cv::gapi::NV12toBGR()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga26fa592432479d54a56e66227f818d7c',1,'NV12toBGR()(Global Namespace)']]], + ['nv12tobgrp_586',['NV12toBGRp',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#gaa41eebd2d72389dcf282850520bd8498',1,'cv::gapi::NV12toBGRp()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#gaa41eebd2d72389dcf282850520bd8498',1,'NV12toBGRp()(Global Namespace)']]], + ['nv12torgb_587',['NV12toRGB',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga0a8da2537ef9dd90d97e4681ca0ff6c6',1,'cv::gapi::NV12toRGB()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga0a8da2537ef9dd90d97e4681ca0ff6c6',1,'NV12toRGB()(Global Namespace)']]], + ['nv12torgbp_588',['NV12toRGBp',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga827c85675868381815af086868e450d6',1,'cv::gapi::NV12toRGBp()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga827c85675868381815af086868e450d6',1,'NV12toRGBp()(Global Namespace)']]], + ['nv_5fof_5fperf_5flevel_5ffast_589',['NV_OF_PERF_LEVEL_FAST',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883baf286f574f3b4423bca135a6065bc5dc1',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], + ['nv_5fof_5fperf_5flevel_5fmax_590',['NV_OF_PERF_LEVEL_MAX',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883bafd171d2741a73d833599a11fcb5e39a1',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], + ['nv_5fof_5fperf_5flevel_5fmedium_591',['NV_OF_PERF_LEVEL_MEDIUM',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883ba3801f2bcf9bf58936ba8488db067efff',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], + ['nv_5fof_5fperf_5flevel_5fslow_592',['NV_OF_PERF_LEVEL_SLOW',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883babe6c4386a3af6c5ff3dcaa1d57ed1276',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], + ['nv_5fof_5fperf_5flevel_5fundefined_593',['NV_OF_PERF_LEVEL_UNDEFINED',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883ba4320ccbbaea021d136ec50e1212d1ee1',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], + ['nvidia_5fof_5fperf_5flevel_594',['NVIDIA_OF_PERF_LEVEL',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883b',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], + ['nvidiahwopticalflow_595',['NvidiaHWOpticalFlow',['https://docs.opencv.org/4.2.0/d5/d26/classcv_1_1cuda_1_1NvidiaHWOpticalFlow.html',1,'cv::cuda']]], + ['nvidiaopticalflow_5f1_5f0_596',['NvidiaOpticalFlow_1_0',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html',1,'cv::cuda']]], + ['nzcount_597',['nzcount',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ad0cd6ef01802341dda3e8b75af5933f0',1,'cv::SparseMat']]] ]; diff --git a/search/all_18.js b/search/all_18.js index 741fc173..ed1e7fb5 100644 --- a/search/all_18.js +++ b/search/all_18.js @@ -10,507 +10,493 @@ var searchData= ['obj_7',['obj',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#aa3a74c8655eb5357a9a9cb4c10b2e032',1,'cv::_InputArray::obj'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a415569785153582f595b68d65576d2c5',1,'cv::ocl::KernelArg::obj']]], ['objdetect_20module_8',['Object Detection (objdetect module)',['https://docs.opencv.org/4.2.0/d2/d64/tutorial_table_of_content_objdetect.html',1,'']]], ['objdetect_2ehpp_9',['objdetect.hpp',['https://docs.opencv.org/4.2.0/d7/df0/objdetect_2objdetect_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/da3/objdetect_8hpp.html',1,'(Global Namespace)']]], - ['object_10',['Features2D + Homography to find a known object',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_feature_homography.html',1,'']]], - ['object_11',['Object',['https://docs.opencv.org/4.2.0/de/d47/structcv_1_1datasets_1_1Object.html',1,'cv::datasets']]], - ['object_12',['object',['https://docs.opencv.org/4.2.0/d4/d36/structcv_1_1dnn__objdetect_1_1object.html',1,'cv::dnn_objdetect']]], - ['object_13',['Object',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#acf2c841a29a7ebda695fd90521c4781f',1,'cv::DetectionBasedTracker']]], - ['object_14',['object',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9a4df356e05415438fadf8a15e583903.html#a9a4df356e05415438fadf8a15e583903',1,'nlohmann::basic_json::object()'],['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'Real Time pose estimation of a textured object']]], - ['object_20categorization_15',['Object Categorization',['https://docs.opencv.org/4.2.0/de/d24/group__features2d__category.html',1,'']]], - ['object_20classification_20and_20pose_20estimation_16',['CNN for 3D Object Classification and Pose Estimation',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'']]], - ['object_20detection_17',['object detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'DNN used for object detection'],['https://docs.opencv.org/4.2.0/d4/d54/group__xobjdetect.html',1,'Extended object detection']]], - ['object_20detection_18',['Object Detection',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d9/d3f/group__cudaobjdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d9/de5/tutorial_py_table_of_contents_objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/dc/d73/tutorial_js_table_of_contents_objdetect.html',1,'Object Detection']]], - ['object_20detection_20objdetect_20module_19',['Object Detection (objdetect module)',['https://docs.opencv.org/4.2.0/d2/d64/tutorial_table_of_content_objdetect.html',1,'']]], - ['object_20detection_20using_20cnns_20',['Object Detection using CNNs',['https://docs.opencv.org/4.2.0/d2/da2/tutorial_dnn_objdetect.html',1,'']]], - ['object_20recognition_21',['Object Recognition',['https://docs.opencv.org/4.2.0/dc/d24/group__datasets__or.html',1,'']]], - ['object_20recognition_20and_20pose_20estimation_20api_22',['3D object recognition and pose estimation API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'']]], - ['object_20tracking_23',['Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'Motion Analysis and Object Tracking'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html',1,'Object Tracking']]], - ['object_5fcomparator_5ft_24',['object_comparator_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac26c2e8d6bcaccde372ceedd81851200.html#ac26c2e8d6bcaccde372ceedd81851200',1,'nlohmann::basic_json']]], - ['object_5ffactory_2eh_25',['object_factory.h',['https://docs.opencv.org/4.2.0/de/d9f/object__factory_8h.html',1,'']]], - ['object_5fid_26',['object_id',['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#ae620ffdbf56387446d9734a8d0be361d',1,'cv::tbm::TrackedObject']]], - ['object_5ft_27',['object_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aef3ff5a73597850597d1d40db9edd376.html#aef3ff5a73597850597d1d40db9edd376',1,'nlohmann::basic_json']]], - ['objectdetection_28',['ObjectDetection',['https://docs.opencv.org/4.2.0/d7/de4/structcv_1_1dpm_1_1DPMDetector_1_1ObjectDetection.html',1,'cv::dpm::DPMDetector::ObjectDetection'],['https://docs.opencv.org/4.2.0/d7/de4/structcv_1_1dpm_1_1DPMDetector_1_1ObjectDetection.html#af28527ec9c3fb19f993b2203c55f6938',1,'cv::dpm::DPMDetector::ObjectDetection::ObjectDetection()'],['https://docs.opencv.org/4.2.0/d7/de4/structcv_1_1dpm_1_1DPMDetector_1_1ObjectDetection.html#a483e6b5702c759aa54441d5d8e410883',1,'cv::dpm::DPMDetector::ObjectDetection::ObjectDetection(const Rect &rect, float score, int classID=-1)']]], - ['objectness_29',['Objectness',['https://docs.opencv.org/4.2.0/d1/d82/classcv_1_1saliency_1_1Objectness.html',1,'cv::saliency']]], - ['objectnessbing_30',['ObjectnessBING',['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html',1,'cv::saliency::ObjectnessBING'],['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#a12e86bd3b4a931bc92741e6f41eca6b0',1,'cv::saliency::ObjectnessBING::ObjectnessBING()']]], - ['objects_31',['Detection of planar objects',['https://docs.opencv.org/4.2.0/dd/dd4/tutorial_detection_of_planar_objects.html',1,'']]], - ['objects_32',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], - ['objects_33',['Fixed-size vectorizable Eigen objects',['https://eigen.tuxfamily.org/dox/group__TopicFixedSizeVectorizable.html',1,'']]], - ['objects_34',['Function Objects',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html',1,'']]], - ['objects_35',['objects',['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html#a1386c7c7c3b5418f0f65a03b93cc5c65',1,'cv::MultiTracker::objects'],['https://docs.opencv.org/4.2.0/d0/db6/structcv_1_1datasets_1_1OR__pascalObj.html#aa11b281db769d93378c2a73968355811',1,'cv::datasets::OR_pascalObj::objects'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a18f9a78b9934e37ae8b8e6ea2a4b5f4d',1,'cv::tbm::Track::objects']]], - ['objects_20by_20value_20to_20functions_36',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], - ['objectstatus_37',['ObjectStatus',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ad43563cc5b954817ad5078f995afd3ff',1,'cv::DetectionBasedTracker']]], - ['objecttracks_38',['ObjectTracks',['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#a23e4438245cbbbab8e7baa38e491a924',1,'cv::tbm']]], - ['objpoints_39',['objPoints',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1aruco_1_1Board.html#ae7c2f21aa18add0211c360935e3f589b',1,'cv::aruco::Board']]], - ['obtainrefinedcameraparams_40',['obtainRefinedCameraParams',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#aae756bac56334dea76d4064c6a32c1a9',1,'cv::detail::BundleAdjusterBase']]], - ['occluded_41',['occluded',['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#a2e6b428365ee28627bc2f148934af48b',1,'cv::datasets::PascalObj']]], - ['occlusionsthreshold_42',['occlusionsThreshold',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#aa3939c091a999a323c42a01b547f8a36',1,'cv::optflow::OpticalFlowPCAFlow']]], - ['ocl_2ehpp_43',['ocl.hpp',['https://docs.opencv.org/4.2.0/da/d74/ocl_8hpp.html',1,'']]], - ['ocl_5fdefs_2ehpp_44',['ocl_defs.hpp',['https://docs.opencv.org/4.2.0/d1/d08/ocl__defs_8hpp.html',1,'']]], - ['ocl_5fgenbase_2ehpp_45',['ocl_genbase.hpp',['https://docs.opencv.org/4.2.0/d1/d1f/ocl__genbase_8hpp.html',1,'']]], - ['ocl_5fget_5fin_46',['ocl_get_in',['https://docs.opencv.org/4.2.0/d1/d1b/structcv_1_1detail_1_1ocl__get__in.html',1,'cv::detail']]], - ['ocl_5fget_5fin_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_47',['ocl_get_in< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/d7/d17/structcv_1_1detail_1_1ocl__get__in_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], - ['ocl_5fget_5fin_3c_20cv_3a_3agmat_20_3e_48',['ocl_get_in< cv::GMat >',['https://docs.opencv.org/4.2.0/d9/de2/structcv_1_1detail_1_1ocl__get__in_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], - ['ocl_5fget_5fin_3c_20cv_3a_3agscalar_20_3e_49',['ocl_get_in< cv::GScalar >',['https://docs.opencv.org/4.2.0/df/dbf/structcv_1_1detail_1_1ocl__get__in_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], - ['ocl_5fget_5fout_50',['ocl_get_out',['https://docs.opencv.org/4.2.0/d4/d3c/structcv_1_1detail_1_1ocl__get__out.html',1,'cv::detail']]], - ['ocl_5fget_5fout_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_51',['ocl_get_out< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/d2/d41/structcv_1_1detail_1_1ocl__get__out_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], - ['ocl_5fget_5fout_3c_20cv_3a_3agmat_20_3e_52',['ocl_get_out< cv::GMat >',['https://docs.opencv.org/4.2.0/d9/db3/structcv_1_1detail_1_1ocl__get__out_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], - ['ocl_5fget_5fout_3c_20cv_3a_3agscalar_20_3e_53',['ocl_get_out< cv::GScalar >',['https://docs.opencv.org/4.2.0/dd/dd4/structcv_1_1detail_1_1ocl__get__out_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], - ['ocl_5fvector_5fdefault_54',['OCL_VECTOR_DEFAULT',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ggae601ac868b72015b583ccbbdd0dec587a566f2a652ca8f26eabf5f6fc50faf59e',1,'cv::ocl::OCL_VECTOR_DEFAULT'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ggae601ac868b72015b583ccbbdd0dec587a566f2a652ca8f26eabf5f6fc50faf59e',1,'OCL_VECTOR_DEFAULT(Global Namespace)']]], - ['ocl_5fvector_5fmax_55',['OCL_VECTOR_MAX',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ggae601ac868b72015b583ccbbdd0dec587a3340448a36ad842065ad35c3586a754e',1,'cv::ocl::OCL_VECTOR_MAX'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ggae601ac868b72015b583ccbbdd0dec587a3340448a36ad842065ad35c3586a754e',1,'OCL_VECTOR_MAX(Global Namespace)']]], - ['ocl_5fvector_5fown_56',['OCL_VECTOR_OWN',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ggae601ac868b72015b583ccbbdd0dec587af4f3dacb8b06545e8e10cdc64d353ed6',1,'cv::ocl::OCL_VECTOR_OWN'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ggae601ac868b72015b583ccbbdd0dec587af4f3dacb8b06545e8e10cdc64d353ed6',1,'OCL_VECTOR_OWN(Global Namespace)']]], - ['oclcallhelper_57',['OCLCallHelper',['https://docs.opencv.org/4.2.0/df/d75/structcv_1_1detail_1_1OCLCallHelper.html',1,'cv::detail']]], - ['oclcallhelper_3c_20impl_2c_20k_3a_3ainargs_2c_20k_3a_3aoutargs_20_3e_58',['OCLCallHelper< Impl, K::InArgs, K::OutArgs >',['https://docs.opencv.org/4.2.0/df/d75/structcv_1_1detail_1_1OCLCallHelper.html',1,'']]], - ['oclcallhelper_3c_20impl_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20outs_2e_2e_2e_20_3e_20_3e_59',['OCLCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... > >',['https://docs.opencv.org/4.2.0/df/d06/structcv_1_1detail_1_1OCLCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_1tuple_3_01Outs_8_8_8_01_4_01_4.html',1,'cv::detail']]], - ['oclsvmdetector_60',['oclSvmDetector',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a42bb83b4d03a8ead9d54e8c5c8463076',1,'cv::HOGDescriptor']]], - ['oclvectorstrategy_61',['OclVectorStrategy',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gae601ac868b72015b583ccbbdd0dec587',1,'cv::ocl::OclVectorStrategy'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gae601ac868b72015b583ccbbdd0dec587',1,'OclVectorStrategy(Global Namespace)']]], - ['ocr_20of_20hand_20written_20data_20using_20knn_62',['OCR of Hand-written Data using kNN',['https://docs.opencv.org/4.2.0/d8/d4b/tutorial_py_knn_opencv.html',1,'']]], - ['ocr_20of_20hand_20written_20data_20using_20svm_63',['OCR of Hand-written Data using SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'']]], - ['ocr_2ehpp_64',['ocr.hpp',['https://docs.opencv.org/4.2.0/db/d5e/ocr_8hpp.html',1,'']]], - ['ocr_5fcnn_5fclassifier_65',['OCR_CNN_CLASSIFIER',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga688d3bbaf5a5ac19ffe9633d7dc0156aaf2248e60e9f6373cd7555a758a910262',1,'cv::text::OCR_CNN_CLASSIFIER'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga688d3bbaf5a5ac19ffe9633d7dc0156aaf2248e60e9f6373cd7555a758a910262',1,'OCR_CNN_CLASSIFIER(Global Namespace)']]], - ['ocr_5fdecoder_5fviterbi_66',['OCR_DECODER_VITERBI',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ggac013d7b1a6a1b7d739b89474c20ec086a9d8baffabe0834b3eacaf2e32a5c7fdd',1,'cv::text::OCR_DECODER_VITERBI'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ggac013d7b1a6a1b7d739b89474c20ec086a9d8baffabe0834b3eacaf2e32a5c7fdd',1,'OCR_DECODER_VITERBI(Global Namespace)']]], - ['ocr_5fengine_5fmode_67',['ocr_engine_mode',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga91c5c4396fea4192c6bf5a8b2eba871a',1,'cv::text::ocr_engine_mode'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga91c5c4396fea4192c6bf5a8b2eba871a',1,'ocr_engine_mode(Global Namespace)']]], - ['ocr_5fknn_5fclassifier_68',['OCR_KNN_CLASSIFIER',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga688d3bbaf5a5ac19ffe9633d7dc0156aafc76612bdc2a94f57f02bd25a6255f12',1,'cv::text::OCR_KNN_CLASSIFIER'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga688d3bbaf5a5ac19ffe9633d7dc0156aafc76612bdc2a94f57f02bd25a6255f12',1,'OCR_KNN_CLASSIFIER(Global Namespace)']]], - ['ocr_5flevel_5ftextline_69',['OCR_LEVEL_TEXTLINE',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga4393eddae65e48ed93934c409bd99126ae3afbc0d74dd08bf11ff430c59d75fa0',1,'cv::text::OCR_LEVEL_TEXTLINE'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga4393eddae65e48ed93934c409bd99126ae3afbc0d74dd08bf11ff430c59d75fa0',1,'OCR_LEVEL_TEXTLINE(Global Namespace)']]], - ['ocr_5flevel_5fword_70',['OCR_LEVEL_WORD',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga4393eddae65e48ed93934c409bd99126ab4582fb3843b8ad7e209bf8f212ac2fe',1,'cv::text::OCR_LEVEL_WORD'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga4393eddae65e48ed93934c409bd99126ab4582fb3843b8ad7e209bf8f212ac2fe',1,'OCR_LEVEL_WORD(Global Namespace)']]], - ['ocrbeamsearchdecoder_71',['OCRBeamSearchDecoder',['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html',1,'cv::text']]], - ['ocrhmmdecoder_72',['OCRHMMDecoder',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html',1,'cv::text']]], - ['ocrholisticwordrecognizer_73',['OCRHolisticWordRecognizer',['https://docs.opencv.org/4.2.0/d0/d8f/classcv_1_1text_1_1OCRHolisticWordRecognizer.html',1,'cv::text']]], - ['ocrtesseract_74',['OCRTesseract',['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html',1,'cv::text']]], - ['oct_75',['oct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'basic_ios< char, _Traits >::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'basic_iostream< char >::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'basic_istream< char >::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'basic_istream< char, _Traits >::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'basic_ostream< char >::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'basic_ostream< char, _Traits >::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_fstream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_ifstream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_ios::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_iostream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_istream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_istringstream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_ofstream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_ostream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_ostringstream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_stringstream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::ios_base::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5fa596d5be9b0fbcf9d9c18b6ed1fe0e',1,'std::oct()']]], - ['octave_76',['octave',['https://docs.opencv.org/4.2.0/d9/daa/structcvhalKeyPoint.html#a4126383574309a7acd431209ae018012',1,'cvhalKeyPoint::octave'],['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#acd62d95914b8005ee4f425c171c2ed1f',1,'cv::line_descriptor::KeyLine::octave'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#aee152750aa98ea54a48196a937197095',1,'cv::KeyPoint::octave']]], - ['octave_5frow_77',['OCTAVE_ROW',['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#a7e4860752f540f81c3674f6efb2c26a3',1,'cv::cuda::ORB::OCTAVE_ROW'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a3b5156553e52661b04bf02fa9628f746a55792ce8877b0fcac85cf25f9ff4882d',1,'cv::cuda::SURF_CUDA::OCTAVE_ROW']]], - ['ocvcallhelper_78',['OCVCallHelper',['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1detail_1_1OCVCallHelper.html',1,'cv::detail']]], - ['ocvcallhelper_3c_20impl_2c_20k_3a_3ainargs_2c_20k_3a_3aoutargs_20_3e_79',['OCVCallHelper< Impl, K::InArgs, K::OutArgs >',['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1detail_1_1OCVCallHelper.html',1,'']]], - ['ocvcallhelper_3c_20impl_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20outs_2e_2e_2e_20_3e_20_3e_80',['OCVCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... > >',['https://docs.opencv.org/4.2.0/da/d5a/structcv_1_1detail_1_1OCVCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_1tuple_3_01Outs_8_8_8_01_4_01_4.html',1,'cv::detail']]], - ['odometry_81',['Odometry',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html',1,'cv::rgbd']]], - ['odometryframe_82',['OdometryFrame',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html',1,'cv::rgbd::OdometryFrame'],['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#aed035e8521f0a32dce451b69ca0bafcd',1,'cv::rgbd::OdometryFrame::OdometryFrame()'],['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#adc3944a88f204c37dcf2ab3615b223b3',1,'cv::rgbd::OdometryFrame::OdometryFrame(const Mat &image, const Mat &depth, const Mat &mask=Mat(), const Mat &normals=Mat(), int ID=-1)']]], - ['oem_5fcube_5fonly_83',['OEM_CUBE_ONLY',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa42027b630054154cd8263f6a70f58ec3',1,'cv::text::OEM_CUBE_ONLY'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa42027b630054154cd8263f6a70f58ec3',1,'OEM_CUBE_ONLY(Global Namespace)']]], - ['oem_5fdefault_84',['OEM_DEFAULT',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa8323b4ed6d93e0dd6b2656dd4eaa11c3',1,'cv::text::OEM_DEFAULT'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa8323b4ed6d93e0dd6b2656dd4eaa11c3',1,'OEM_DEFAULT(Global Namespace)']]], - ['oem_5ftesseract_5fcube_5fcombined_85',['OEM_TESSERACT_CUBE_COMBINED',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa12cb4b814e595a715a93ddca68d07787',1,'cv::text::OEM_TESSERACT_CUBE_COMBINED'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa12cb4b814e595a715a93ddca68d07787',1,'OEM_TESSERACT_CUBE_COMBINED(Global Namespace)']]], - ['oem_5ftesseract_5fonly_86',['OEM_TESSERACT_ONLY',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa308fc26cecf758c6d7f4d503f9c9d5a2',1,'cv::text::OEM_TESSERACT_ONLY'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa308fc26cecf758c6d7f4d503f9c9d5a2',1,'OEM_TESSERACT_ONLY(Global Namespace)']]], - ['of_20a_20textured_20object_87',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], - ['of_20a_20widget_88',['Pose of a widget',['https://docs.opencv.org/4.2.0/d8/df0/tutorial_widget_pose.html',1,'']]], - ['of_20an_20image_89',['Changing the contrast and brightness of an image!',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'']]], - ['of_20any_20type_90',['Type-safe container of any type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html',1,'']]], - ['of_20aruco_20boards_91',['Detection of ArUco Boards',['https://docs.opencv.org/4.2.0/db/da9/tutorial_aruco_board_detection.html',1,'']]], - ['of_20aruco_20markers_92',['Detection of ArUco Markers',['https://docs.opencv.org/4.2.0/d5/dae/tutorial_aruco_detection.html',1,'']]], - ['of_20charuco_20corners_93',['Detection of ChArUco Corners',['https://docs.opencv.org/4.2.0/df/d4a/tutorial_charuco_detection.html',1,'']]], - ['of_20coefficient_20wise_20math_20functions_94',['Catalog of coefficient-wise math functions',['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'']]], - ['of_20computer_20vision_20applications_95',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], - ['of_20computer_20vision_20programs_96',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], - ['of_20dense_20decompositions_97',['of dense decompositions',['https://eigen.tuxfamily.org/dox/group__DenseDecompositionBenchmark.html',1,'Benchmark of dense decompositions'],['https://eigen.tuxfamily.org/dox/group__TopicLinearAlgebraDecompositions.html',1,'Catalogue of dense decompositions']]], - ['of_20diamond_20markers_98',['Detection of Diamond Markers',['https://docs.opencv.org/4.2.0/d5/d07/tutorial_charuco_diamond_detection.html',1,'']]], - ['of_20different_20image_20hashing_20algorithms_99',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], - ['of_20eigen_100',['Experimental parts of Eigen',['https://eigen.tuxfamily.org/dox/Experimental.html',1,'']]], - ['of_20focus_20deblur_20filter_101',['Out-of-focus Deblur Filter',['https://docs.opencv.org/4.2.0/de/d3c/tutorial_out_of_focus_deblur_filter.html',1,'']]], - ['of_20hand_20written_20data_20using_20knn_102',['OCR of Hand-written Data using kNN',['https://docs.opencv.org/4.2.0/d8/d4b/tutorial_py_knn_opencv.html',1,'']]], - ['of_20hand_20written_20data_20using_20svm_103',['OCR of Hand-written Data using SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'']]], - ['of_20images_104',['of Images',['https://docs.opencv.org/4.2.0/da/d6e/tutorial_py_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dd/d52/tutorial_js_geometric_transformations.html',1,'Geometric Transformations of Images']]], - ['of_20implemented_20layers_105',['Partial List of Implemented Layers',['https://docs.opencv.org/4.2.0/d6/d87/group__dnnLayerList.html',1,'']]], - ['of_20keypoints_20and_20matches_106',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], - ['of_20planar_20objects_107',['Detection of planar objects',['https://docs.opencv.org/4.2.0/dd/dd4/tutorial_detection_of_planar_objects.html',1,'']]], - ['of_20the_20assertion_20on_20unaligned_20arrays_108',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], - ['of_20the_20homography_20explained_20with_20code_109',['Basic concepts of the homography explained with code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'']]], - ['off_5ftype_110',['off_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a9b0940b8e61b43dbb5c0f1bb268ce944',1,'basic_ios< char, _Traits >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a9b0940b8e61b43dbb5c0f1bb268ce944',1,'basic_ios< char, _Traits >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'basic_streambuf< _Elem, _Tr >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'basic_streambuf< _Elem, _Tr >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'basic_streambuf< char, _Traits >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'basic_streambuf< char, _Traits >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'basic_streambuf< char, char_traits< char > >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'basic_streambuf< char, char_traits< char > >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a9b0940b8e61b43dbb5c0f1bb268ce944',1,'std::basic_ios::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a9b0940b8e61b43dbb5c0f1bb268ce944',1,'std::basic_ios::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'std::basic_streambuf::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'std::basic_streambuf::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'std::wbuffer_convert::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'std::wbuffer_convert::off_type']]], - ['offset_111',['offset',['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aefd8bc792218830014d8a99357acefa3',1,'cv::UMat::offset'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a65071abdc2def57324376f3f56cac370',1,'cv::_InputArray::offset()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a4a9fae414234e9513194b69a878a4225',1,'Eigen::Hyperplane::offset()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a7451d5993c7b87e2ff358e0aa3a06175',1,'Eigen::Hyperplane::offset() const']]], - ['ofs_112',['ofs',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a824f3fd3cd0f3a3be9cecc66ceb32065',1,'cv::FileNode::ofs'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a231c0c7d30c035d1ac9536c59fb018b8',1,'cv::FileNodeIterator::ofs'],['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#a5b35b2b2ed439cc747eeae85bb0228ee',1,'cv::datasets::HPE_humanevaObj::ofs']]], - ['ofstream_113',['ofstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga7a439605cbbc7d72fcefc9d6a59c4f0a',1,'std::ofstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga7a439605cbbc7d72fcefc9d6a59c4f0a',1,'ofstream(Global Namespace)']]], - ['ogre_203d_20visualiser_114',['OGRE 3D Visualiser',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html',1,'']]], - ['oil_20painting_20effect_115',['Oil painting effect',['https://docs.opencv.org/4.2.0/dd/d8c/tutorial_xphoto_oil_painting_effect.html',1,'']]], - ['oil_5fpainting_5feffect_2emarkdown_116',['oil_painting_effect.markdown',['https://docs.opencv.org/4.2.0/d4/d7d/oil__painting__effect_8markdown.html',1,'']]], - ['oilpainting_117',['oilPainting',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac050a6e876298cb9713cd2c09db9a027',1,'cv::xphoto::oilPainting(InputArray src, OutputArray dst, int size, int dynRatio, int code)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac18ef93a7b1e65f703f7dc3b1e8e5235',1,'cv::xphoto::oilPainting(InputArray src, OutputArray dst, int size, int dynRatio)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac050a6e876298cb9713cd2c09db9a027',1,'oilPainting(InputArray src, OutputArray dst, int size, int dynRatio, int code)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac18ef93a7b1e65f703f7dc3b1e8e5235',1,'oilPainting(InputArray src, OutputArray dst, int size, int dynRatio)(Global Namespace)']]], - ['oilpainting_2ehpp_118',['oilpainting.hpp',['https://docs.opencv.org/4.2.0/dc/d56/oilpainting_8hpp.html',1,'']]], - ['ok_119',['OK',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a507409ce9435dd89857469d12ec06b45afc04343b65c6780b62b684ed14e26586',1,'cv::Stitcher']]], - ['olive_120',['olive',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a46c5e1634ff57241cdceda2546520a8a',1,'cv::viz::Color']]], - ['omnidir_2ehpp_121',['omnidir.hpp',['https://docs.opencv.org/4.2.0/db/d62/omnidir_8hpp.html',1,'']]], - ['omnidir_5ftutorial_2emarkdown_122',['omnidir_tutorial.markdown',['https://docs.opencv.org/4.2.0/dc/d3a/omnidir__tutorial_8markdown.html',1,'']]], - ['omnidirectional_123',['OMNIDIRECTIONAL',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#ab2a2522a8e0bf60ee24416e0ec37ba3ea36e58b4ea6bf200b89ca9536783c5dbc',1,'cv::multicalib::MultiCameraCalibration']]], - ['omnidirectional_20cameara_20calibration_124',['Omnidirectional Cameara Calibration',['https://docs.opencv.org/4.2.0/dd/d12/tutorial_omnidir_calib_main.html',1,'']]], - ['omp_5floop_2eh_125',['omp_loop.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00932.html',1,'']]], - ['omp_5floop_5fstatic_2eh_126',['omp_loop_static.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00935.html',1,'']]], - ['omp_5floop_5fstatic_5ftag_127',['omp_loop_static_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09727.html',1,'__gnu_parallel']]], - ['omp_5floop_5ftag_128',['omp_loop_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09723.html',1,'__gnu_parallel']]], - ['on_129',['on',['https://docs.opencv.org/4.2.0/df/d7c/classcv_1_1GKernelType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a22b2b5fd61dd5989e0b283d1874bc39b',1,'cv::GKernelType< K, std::function< R(Args...)> >::on()'],['https://docs.opencv.org/4.2.0/dc/d2d/classcv_1_1GKernelTypeM_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#ab5e3c7ebaad0127424a14bddf068caf0',1,'cv::GKernelTypeM< K, std::function< std::tuple< R... >(Args...)> >::on()']]], - ['on_20a_20simple_20example_130',['What happens inside Eigen, on a simple example',['https://eigen.tuxfamily.org/dox/TopicInsideEigenExample.html',1,'']]], - ['on_20android_20device_131',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], - ['on_20arrays_132',['Operations on arrays',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html',1,'']]], - ['on_20facial_20landmark_20detector_20api_133',['Tutorial on Facial Landmark Detector API',['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'']]], - ['on_20fuzzy_20mathematics_134',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], - ['on_20g_20api_135',['Porting anisotropic image segmentation on G-API',['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'']]], - ['on_20images_136',['on Images',['https://docs.opencv.org/4.2.0/d0/d86/tutorial_py_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/d3/df2/tutorial_py_basic_ops.html',1,'Basic Operations on Images'],['https://docs.opencv.org/4.2.0/de/d06/tutorial_js_basic_ops.html',1,'Basic Operations on Images']]], - ['on_20matrices_137',['on Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'Arithm Operations on Matrices'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'Core Operations on Matrices']]], - ['on_20matrices_138',['on matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'Graph API: Operations on matrices'],['https://docs.opencv.org/4.2.0/d7/d37/tutorial_mat_mask_operations.html',1,'Mask operations on matrices']]], - ['on_20matrices_139',['Operations on Matrices',['https://docs.opencv.org/4.2.0/d5/d8e/group__cudaarithm.html',1,'']]], - ['on_20run_20length_20encoded_20image_140',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], - ['on_20stack_20alignment_141',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], - ['on_20the_20gpu_142',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], - ['on_20unaligned_20arrays_143',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], - ['onbeginframe_144',['onBeginFrame',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1cudacodec_1_1EncoderCallBack.html#a277162f0366d3d8caae0a51adcefc8fc',1,'cv::cudacodec::EncoderCallBack']]], - ['once_5fflag_145',['once_flag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02635.html',1,'std::once_flag'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02635.html#a78b964b5391b5aa7da309eb3d8b88178',1,'std::once_flag::once_flag() noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02635.html#a60da2be389d0324a5210bd778a522af8',1,'std::once_flag::once_flag(const once_flag &)=delete']]], - ['one_146',['one',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga87203f2a67ddb911cc8cbb8984a8c7e6',1,'cv::softdouble::one()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga214e54c7bf87163f778fc5212c0c92f5',1,'cv::softfloat::one()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga214e54c7bf87163f778fc5212c0c92f5',1,'one()(Global Namespace)']]], - ['one_20color_20space_20to_20another_147',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], - ['one_5fclass_148',['ONE_CLASS',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa6951543a0c14a17a7e16d212b1e7dcaf',1,'cv::ml::SVM']]], - ['one_5fstep_149',['ONE_STEP',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#gga6a4ee3a5f9fd35c1b350a1049d8abc9dae6619bf12f07b1ec1f249341568fd56d',1,'cv::ft::ONE_STEP'],['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#gga6a4ee3a5f9fd35c1b350a1049d8abc9dae6619bf12f07b1ec1f249341568fd56d',1,'ONE_STEP(Global Namespace)']]], - ['onendframe_150',['onEndFrame',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1cudacodec_1_1EncoderCallBack.html#ac663a41e183e1c482b7eef6054bfae23',1,'cv::cudacodec::EncoderCallBack']]], - ['onepassstabilizer_151',['OnePassStabilizer',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html',1,'cv::videostab::OnePassStabilizer'],['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#a127cccfe617f6909764fdf5de436c85f',1,'cv::videostab::OnePassStabilizer::OnePassStabilizer()']]], - ['ones_152',['Ones',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2755cb4023f7376880523626a8e05101',1,'Eigen::DenseBase::Ones()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8b2a51018a73a766f5b91aef3487f013',1,'Eigen::DenseBase::Ones(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab710a58e4a80fbcb2594242372c8fe56',1,'Eigen::DenseBase::Ones(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2755cb4023f7376880523626a8e05101',1,'DenseBase< ArrayWrapper< ExpressionType > >::Ones()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8b2a51018a73a766f5b91aef3487f013',1,'DenseBase< ArrayWrapper< ExpressionType > >::Ones(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab710a58e4a80fbcb2594242372c8fe56',1,'DenseBase< ArrayWrapper< ExpressionType > >::Ones(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2755cb4023f7376880523626a8e05101',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Ones()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8b2a51018a73a766f5b91aef3487f013',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Ones(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab710a58e4a80fbcb2594242372c8fe56',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Ones(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2755cb4023f7376880523626a8e05101',1,'DenseBase< Solve< Decomposition, RhsType > >::Ones()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8b2a51018a73a766f5b91aef3487f013',1,'DenseBase< Solve< Decomposition, RhsType > >::Ones(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab710a58e4a80fbcb2594242372c8fe56',1,'DenseBase< Solve< Decomposition, RhsType > >::Ones(Index size)']]], - ['ones_153',['ones',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a69ae0402d116fc9c71908d8508dc2f09',1,'cv::Mat::ones(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#afc9c2c0b17ecd00932bc5fbc72f9bce0',1,'cv::Mat::ones(Size size, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a6ed33f15d7bf0172efb62d61b3751284',1,'cv::Mat::ones(int ndims, const int *sz, int type)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a32a2d59f84562e2357176352cfa4b66b',1,'cv::Mat_::ones(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a962c5ba7d1dda84c10c537295b1ff4e8',1,'cv::Mat_::ones(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3fe588491bfb97cce6c747d72f4ed27d',1,'cv::Mat_::ones(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a32a2d59f84562e2357176352cfa4b66b',1,'Mat_< double >::ones(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a962c5ba7d1dda84c10c537295b1ff4e8',1,'Mat_< double >::ones(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3fe588491bfb97cce6c747d72f4ed27d',1,'Mat_< double >::ones(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a32a2d59f84562e2357176352cfa4b66b',1,'Mat_< float >::ones(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a962c5ba7d1dda84c10c537295b1ff4e8',1,'Mat_< float >::ones(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3fe588491bfb97cce6c747d72f4ed27d',1,'Mat_< float >::ones(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a32a2d59f84562e2357176352cfa4b66b',1,'Mat_< uchar >::ones(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a962c5ba7d1dda84c10c537295b1ff4e8',1,'Mat_< uchar >::ones(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3fe588491bfb97cce6c747d72f4ed27d',1,'Mat_< uchar >::ones(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a32a2d59f84562e2357176352cfa4b66b',1,'Mat_< unsigned char >::ones(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a962c5ba7d1dda84c10c537295b1ff4e8',1,'Mat_< unsigned char >::ones(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3fe588491bfb97cce6c747d72f4ed27d',1,'Mat_< unsigned char >::ones(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'cv::Matx::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< _Tp, cn, 1 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, 1, 3 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, 2, 2 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, 2, 3 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, 3, 3 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, 3, 4 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, 4, 4 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, cn, 1 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< float, 2, 3 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< float, 3, 3 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< float, cn, 1 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< float_type, 4, 4 >::ones()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#adf78401deb21d2b46144db979a86a296',1,'cv::UMat::ones(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a85f38b108c177ed5696aa4295f45ea4e',1,'cv::UMat::ones(Size size, int type)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ae6f92d67658151a00723abdbabe572b8',1,'cv::UMat::ones(int ndims, const int *sz, int type)']]], - ['onlineboosting_2ehpp_154',['onlineBoosting.hpp',['https://docs.opencv.org/4.2.0/d9/dd7/onlineBoosting_8hpp.html',1,'']]], - ['onlinemil_2ehpp_155',['onlineMIL.hpp',['https://docs.opencv.org/4.2.0/de/d5c/onlineMIL_8hpp.html',1,'']]], - ['ontheleft_156',['OnTheLeft',['https://eigen.tuxfamily.org/dox/group__enums.html#ggac22de43beeac7a78b384f99bed5cee0ba21b30a61e9cb10c967aec17567804007',1,'Eigen::OnTheLeft'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggac22de43beeac7a78b384f99bed5cee0ba21b30a61e9cb10c967aec17567804007',1,'OnTheLeft(Global Namespace)']]], - ['ontheright_157',['OnTheRight',['https://eigen.tuxfamily.org/dox/group__enums.html#ggac22de43beeac7a78b384f99bed5cee0ba329fc3a54ceb2b6e0e73b400998b8a82',1,'Eigen::OnTheRight'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggac22de43beeac7a78b384f99bed5cee0ba329fc3a54ceb2b6e0e73b400998b8a82',1,'OnTheRight(Global Namespace)']]], - ['op_158',['op',['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#ad8e79acfd982f0647959ecdff2400508',1,'cv::cudev::BinaryTransformPtr::op'],['https://docs.opencv.org/4.2.0/dc/da3/structcv_1_1cudev_1_1BinaryTupleAdapter.html#a088973d5582ea710c8da3943c4b5d185',1,'cv::cudev::BinaryTupleAdapter::op'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1Binder1st.html#a19e90d48e23e9a6db12ab942b7622e67',1,'cv::cudev::Binder1st::op'],['https://docs.opencv.org/4.2.0/d6/db4/structcv_1_1cudev_1_1Binder2nd.html#a5c9916f5e382734185f9abbb34d6b31f',1,'cv::cudev::Binder2nd::op'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a98f8a4a0853cb5ac6b147238f3d4ad1f',1,'cv::MatExpr::op'],['https://docs.opencv.org/4.2.0/dd/d01/structcv_1_1cudev_1_1UnaryTransformPtr.html#ac22a69fee93f1ae30e2307766432f7ec',1,'cv::cudev::UnaryTransformPtr::op'],['https://docs.opencv.org/4.2.0/d4/d57/structcv_1_1cudev_1_1UnaryTupleAdapter.html#a06a4e7b5e8ae9bc5e39eef69ff2d6489',1,'cv::cudev::UnaryTupleAdapter::op']]], - ['opacity_159',['OPACITY',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acadf29e51a4d564723ffac7ae2eaf2ccab',1,'cv::viz::OPACITY'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acadf29e51a4d564723ffac7ae2eaf2ccab',1,'OPACITY(Global Namespace)']]], - ['opaque_160',['opaque',['https://docs.opencv.org/4.2.0/de/d30/structcv_1_1GKernelImpl.html#a8bad17cf833d8a3fd75db96c4b42647a',1,'cv::GKernelImpl']]], - ['open_161',['open',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a14c2c18dc2e29999d03d52a0c24bd91c',1,'cv::FileStorage::open()'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a614a1702e15f42ede5100014ce7f48ed',1,'cv::VideoCapture::open(const String &filename, int apiPreference=CAP_ANY)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a49e87ea8665f471b76a48c0a6c537fb7',1,'cv::VideoCapture::open(int index, int apiPreference=CAP_ANY)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a0901c353cd5ea05bba455317dab81130',1,'cv::VideoWriter::open(const String &filename, int fourcc, double fps, Size frameSize, bool isColor=true)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a808ee7d60c58af071035a19e396bfa91',1,'cv::VideoWriter::open(const String &filename, int apiPreference, int fourcc, double fps, Size frameSize, bool isColor=true)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#ad72dc61561f4420b36f9e626b4426433',1,'__gnu_cxx::enc_filebuf::open(const char *__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a541062313b01b7bb74af2582f88a365f',1,'__gnu_cxx::enc_filebuf::open(const std::string &__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#ad72dc61561f4420b36f9e626b4426433',1,'__gnu_cxx::stdio_filebuf::open(const char *__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a541062313b01b7bb74af2582f88a365f',1,'__gnu_cxx::stdio_filebuf::open(const std::string &__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#ad72dc61561f4420b36f9e626b4426433',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::open(const char *__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a541062313b01b7bb74af2582f88a365f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::open(const std::string &__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#ad72dc61561f4420b36f9e626b4426433',1,'basic_filebuf< char_type, traits_type >::open(const char *__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a541062313b01b7bb74af2582f88a365f',1,'basic_filebuf< char_type, traits_type >::open(const std::string &__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#ad72dc61561f4420b36f9e626b4426433',1,'std::basic_filebuf::open(const char *__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a541062313b01b7bb74af2582f88a365f',1,'std::basic_filebuf::open(const std::string &__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02079.html#a3a4c04e09a683bc30e9c5c19bdbbcda4',1,'std::basic_fstream::open(const char *__s, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02079.html#a4e3a98b2a30cf6f0e3eaff8eeb9eee47',1,'std::basic_fstream::open(const std::string &__s, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02071.html#a642496a04b7adb81e614d2b3903734ff',1,'std::basic_ifstream::open(const char *__s, ios_base::openmode __mode=ios_base::in)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02071.html#ab7c7c2bf6e27152bb0460c83c32ab431',1,'std::basic_ifstream::open(const std::string &__s, ios_base::openmode __mode=ios_base::in)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02075.html#a81f26964cd5c6cc8d3e833735f606646',1,'std::basic_ofstream::open(const char *__s, ios_base::openmode __mode=ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02075.html#a3da82e8f108d33a7e5de244695d2a28b',1,'std::basic_ofstream::open(const std::string &__s, ios_base::openmode __mode=ios_base::out)'],['../classcam_1_1Camera.html#a42a4cb744e4fd07387c7a6dedd99b45b',1,'cam::Camera::open(std::string filename, CameraParams intrinsic_params=CameraParams(), cv::Mat extrinsic_params=cv::Mat())'],['../classcam_1_1Camera.html#a8829ed566f7b6c891f2e29d568705189',1,'cam::Camera::open(int camera_id, CameraParams intrinsic_params=CameraParams(), cv::Mat extrinsic_params=cv::Mat())'],['https://docs.opencv.org/4.2.0/d6/dee/group__hdf5.html#ga243d7e303690af3c5c3686ca5785205e',1,'cv::hdf::open()'],['https://docs.opencv.org/4.2.0/d6/dee/group__hdf5.html#ga243d7e303690af3c5c3686ca5785205e',1,'open()(Global Namespace)']]], - ['open_5fcamera_162',['OPEN_CAMERA',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html#gga5291115322efc2f86c7551ab37ab6554a0138ded351ab41c87d216bf128bcc1b7',1,'cv::OPEN_CAMERA'],['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html#gga5291115322efc2f86c7551ab37ab6554a0138ded351ab41c87d216bf128bcc1b7',1,'OPEN_CAMERA(Global Namespace)']]], - ['opencl_20cl_20va_20interoperability_163',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], - ['opencl_20in_20android_20camera_20preview_20based_20cv_20application_164',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], - ['opencl_20support_165',['OpenCL support',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html',1,'']]], - ['opencl_5fc_5fversion_166',['OpenCL_C_Version',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2e227e1779bef769064ca0c436cc10af',1,'cv::ocl::Device']]], - ['opencl_5finfo_2ehpp_167',['opencl_info.hpp',['https://docs.opencv.org/4.2.0/d6/d54/opencl__info_8hpp.html',1,'']]], - ['opencl_5fsvm_2ehpp_168',['opencl_svm.hpp',['https://docs.opencv.org/4.2.0/df/d48/opencl__svm_8hpp.html',1,'']]], - ['openclapicallerror_169',['OpenCLApiCallError',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa9bef3bdb9825b3eb17f43e20980bd651',1,'cv::Error']]], - ['opencldoublenotsupported_170',['OpenCLDoubleNotSupported',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa1968883aa9ea7c47509d657bf802aea5',1,'cv::Error']]], - ['opencliniterror_171',['OpenCLInitError',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa4c2ce87013f9b175a293ff2f0bcbc00f',1,'cv::Error']]], - ['openclnoamdblasfft_172',['OpenCLNoAMDBlasFft',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa5d99510b10d71eadc2e42f19f4d8c088',1,'cv::Error']]], - ['openclversion_173',['OpenCLVersion',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ac882a36c0b1a7eebeebae6530a0c1c6e',1,'cv::ocl::Device']]], - ['opencv_174',['OpenCV',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_adding_images.html',1,'Adding (blending) two images using OpenCV'],['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'Android Development with OpenCV'],['https://docs.opencv.org/4.2.0/d4/d94/tutorial_camera_calibration.html',1,'Camera calibration With OpenCV'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html',1,'ColorMaps in OpenCV'],['https://docs.opencv.org/4.2.0/d3/d05/tutorial_py_table_of_contents_contours.html',1,'Contours in OpenCV'],['https://docs.opencv.org/4.2.0/d7/d9e/tutorial_video_write.html',1,'Creating a video with OpenCV'],['https://docs.opencv.org/4.2.0/dc/da5/tutorial_py_drawing_functions.html',1,'Drawing Functions in OpenCV'],['https://docs.opencv.org/4.2.0/da/d60/tutorial_face_main.html',1,'Face Recognition with OpenCV'],['https://docs.opencv.org/4.2.0/dc/d4d/tutorial_py_table_of_contents_gui.html',1,'Gui Features in OpenCV'],['https://docs.opencv.org/4.2.0/de/db2/tutorial_py_table_of_contents_histograms.html',1,'Histograms in OpenCV'],['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'How to scan images, lookup tables and time measurement with OpenCV'],['https://docs.opencv.org/4.2.0/d2/d96/tutorial_py_table_of_contents_imgproc.html',1,'Image Processing in OpenCV'],['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'Image Transforms in OpenCV'],['https://docs.opencv.org/4.2.0/df/d65/tutorial_table_of_content_introduction.html',1,'Introduction to OpenCV'],['https://docs.opencv.org/4.2.0/da/df6/tutorial_py_table_of_contents_setup.html',1,'Introduction to OpenCV'],['https://docs.opencv.org/4.2.0/d1/d5c/tutorial_py_kmeans_opencv.html',1,'K-Means Clustering in OpenCV'],['https://docs.opencv.org/4.2.0/df/d61/tutorial_random_generator_and_text.html',1,'Random generator and text with OpenCV'],['https://docs.opencv.org/4.2.0/d4/db1/tutorial_documentation.html',1,'Writing documentation for OpenCV']]], - ['opencv_20and_20similarity_20measurement_175',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], - ['opencv_20development_20with_20clojure_176',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], - ['opencv_20for_20tegra_20with_20cuda_177',['Building OpenCV for Tegra with CUDA',['https://docs.opencv.org/4.2.0/d6/d15/tutorial_building_tegra_cuda.html',1,'']]], - ['opencv_20from_20other_20doxygen_20projects_178',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], - ['opencv_20inside_20the_20microsoft_20visual_20studio_179',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['opencv_20ios_180',['OpenCV iOS',['https://docs.opencv.org/4.2.0/d3/dc9/tutorial_table_of_content_ios.html',1,'']]], - ['opencv_20ios_20hello_181',['OpenCV iOS Hello',['https://docs.opencv.org/4.2.0/d7/d88/tutorial_hello.html',1,'']]], - ['opencv_20ios_20image_20processing_182',['OpenCV iOS - Image Processing',['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'']]], - ['opencv_20ios_20video_20processing_183',['OpenCV iOS - Video Processing',['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'']]], - ['opencv_20java_20with_20eclipse_184',['Using OpenCV Java with Eclipse',['https://docs.opencv.org/4.2.0/d1/d0a/tutorial_java_eclipse.html',1,'']]], - ['opencv_20js_185',['OpenCV js',['https://docs.opencv.org/4.2.0/d4/da1/tutorial_js_setup.html',1,'Build OpenCV.js'],['https://docs.opencv.org/4.2.0/d0/d43/tutorial_js_table_of_contents_contours.html',1,'Contours in OpenCV.js'],['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'Histograms in OpenCV.js'],['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'Image Transforms in OpenCV.js'],['https://docs.opencv.org/4.2.0/df/df7/tutorial_js_table_of_contents_setup.html',1,'Introduction to OpenCV.js'],['https://docs.opencv.org/4.2.0/d0/d84/tutorial_js_usage.html',1,'Using OpenCV.js']]], - ['opencv_20js_20and_20tutorials_186',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], - ['opencv_20js_20in_20node_20js_187',['Using OpenCV.js In Node.js',['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'']]], - ['opencv_20js_20tutorials_188',['OpenCV.js Tutorials',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_js_root.html',1,'']]], - ['opencv_20overview_189',['Video I/O with OpenCV Overview',['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'']]], - ['opencv_20parallel_5ffor_5f_20to_20parallelize_20your_20code_190',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], - ['opencv_20python_20bindings_191',['OpenCV-Python Bindings',['https://docs.opencv.org/4.2.0/df/da2/tutorial_py_table_of_contents_bindings.html',1,'']]], - ['opencv_20python_20bindings_20works_192',['How OpenCV-Python Bindings Works?',['https://docs.opencv.org/4.2.0/da/d49/tutorial_py_bindings_basics.html',1,'']]], - ['opencv_20python_20in_20fedora_193',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], - ['opencv_20python_20in_20ubuntu_194',['Install OpenCV-Python in Ubuntu',['https://docs.opencv.org/4.2.0/d2/de6/tutorial_py_setup_in_ubuntu.html',1,'']]], - ['opencv_20python_20in_20windows_195',['Install OpenCV-Python in Windows',['https://docs.opencv.org/4.2.0/d5/de5/tutorial_py_setup_in_windows.html',1,'']]], - ['opencv_20python_20tutorials_196',['OpenCV Python Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'Introduction to OpenCV-Python Tutorials'],['https://docs.opencv.org/4.2.0/d6/d00/tutorial_py_root.html',1,'OpenCV-Python Tutorials']]], - ['opencv_20samples_197',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]], - ['opencv_20tracker_198',['Introduction to OpenCV Tracker',['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'']]], - ['opencv_20tutorials_199',['OpenCV Tutorials',['https://docs.opencv.org/4.2.0/d9/df8/tutorial_root.html',1,'']]], - ['opencv_20viz_200',['OpenCV Viz',['https://docs.opencv.org/4.2.0/d7/df9/tutorial_table_of_content_viz.html',1,'']]], - ['opencv_20with_20eclipse_20plugin_20cdt_201',['Using OpenCV with Eclipse (plugin CDT)',['https://docs.opencv.org/4.2.0/d7/d16/tutorial_linux_eclipse.html',1,'']]], - ['opencv_20with_20gcc_20and_20cmake_202',['Using OpenCV with gcc and CMake',['https://docs.opencv.org/4.2.0/db/df5/tutorial_linux_gcc_cmake.html',1,'']]], - ['opencv4android_20sdk_203',['OpenCV4Android SDK',['https://docs.opencv.org/4.2.0/da/d2a/tutorial_O4A_SDK.html',1,'']]], - ['opencv_5fapi_5fheader_204',['OpenCV_API_Header',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html',1,'']]], - ['opencv_5fincludes_2ehpp_205',['opencv_includes.hpp',['https://docs.opencv.org/4.2.0/dc/d17/opencv__includes_8hpp.html',1,'']]], - ['opencv_5fversion_5fmajor_206',['opencv_version_major',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#aea2d7d3aee5b524576faf6fa824530ae',1,'OpenCV_API_Header']]], - ['opencv_5fversion_5fminor_207',['opencv_version_minor',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#a6cb67df066743a77434869554bb44587',1,'OpenCV_API_Header']]], - ['opencv_5fversion_5fpatch_208',['opencv_version_patch',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#aeb1c3169a88e1286e9464b22317fc707',1,'OpenCV_API_Header']]], - ['opencv_5fversion_5fstatus_209',['opencv_version_status',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#ae05496ecef5bfc87460a7d4f5779806b',1,'OpenCV_API_Header']]], - ['openfromconfigfile_210',['openFromConfigFile',['../classcam_1_1Camera.html#a345be047450323f7f58a1d7d82bdb51a',1,'cam::Camera']]], - ['opengl_20interoperability_211',['OpenGL interoperability',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html',1,'']]], - ['opengl_20support_212',['OpenGL support',['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html',1,'']]], - ['opengl_2ehpp_213',['opengl.hpp',['https://docs.opencv.org/4.2.0/d4/db0/opengl_8hpp.html',1,'']]], - ['opengl_5fbuffer_214',['OPENGL_BUFFER',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53bac0f3b1297b8b3abf313d7e4e51346d70',1,'cv::_InputArray']]], - ['openglapicallerror_215',['OpenGlApiCallError',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa9f71b79f0b0cb60879173bd9cef8c639',1,'cv::Error']]], - ['opengldrawcallback_216',['OpenGlDrawCallback',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8bed4feb08f866e81514a31fdacaceee',1,'cv::OpenGlDrawCallback'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8bed4feb08f866e81514a31fdacaceee',1,'OpenGlDrawCallback(Global Namespace)']]], - ['openglnotsupported_217',['OpenGlNotSupported',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaaf236f11d402e491ba469756c7062b418',1,'cv::Error']]], - ['opening_5fclosing_5fhats_2emarkdown_218',['opening_closing_hats.markdown',['https://docs.opencv.org/4.2.0/dd/d42/opening__closing__hats_8markdown.html',1,'']]], - ['openmode_219',['openmode',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'basic_ios< char, _Traits >::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'basic_iostream< char >::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'basic_istream< char >::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'basic_istream< char, _Traits >::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'basic_ostream< char >::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'basic_ostream< char, _Traits >::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_fstream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_ifstream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_ios::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_iostream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_istream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_istringstream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_ofstream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_ostream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_ostringstream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_stringstream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::ios_base::openmode']]], - ['openni_20compatible_20depth_20sensors_220',['Using Kinect and other OpenNI compatible depth sensors',['https://docs.opencv.org/4.2.0/d7/d6f/tutorial_kinect_openni.html',1,'']]], - ['openstream_221',['openStream',['../classnet_1_1mc_1_1tasks_1_1CameraStreamTask.html#a33ad00d78998950b1f1f8a0956141b1f',1,'net::mc::tasks::CameraStreamTask']]], - ['operations_222',['Basic Thresholding Operations',['https://docs.opencv.org/4.2.0/db/d8e/tutorial_threshold.html',1,'']]], - ['operations_223',['operations',['https://docs.opencv.org/4.2.0/d2/d18/group__core__hal__interface__logical.html',1,'Bitwise logical operations'],['https://eigen.tuxfamily.org/dox/group__TutorialBlockOperations.html',1,'Block operations'],['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'C structures and operations']]], - ['operations_224',['Operations',['https://docs.opencv.org/4.2.0/d7/d16/tutorial_py_table_of_contents_core.html',1,'Core Operations'],['https://docs.opencv.org/4.2.0/d1/d78/tutorial_js_table_of_contents_core.html',1,'Core Operations']]], - ['operations_225',['operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'Extract horizontal and vertical lines by using morphological operations'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html',1,'Generalized Numeric operations'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html',1,'Graph API: Math operations'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html',1,'Graph API: Pixelwise operations']]], - ['operations_226',['Operations',['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html',1,'Per-element Operations'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html',1,'Set Operations']]], - ['operations_227',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], - ['operations_20and_20functions_228',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], - ['operations_20classes_229',['Boolean Operations Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01508.html',1,'']]], - ['operations_20on_20arrays_230',['Operations on arrays',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html',1,'']]], - ['operations_20on_20images_231',['Operations on Images',['https://docs.opencv.org/4.2.0/d0/d86/tutorial_py_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/d3/df2/tutorial_py_basic_ops.html',1,'Basic Operations on Images'],['https://docs.opencv.org/4.2.0/de/d06/tutorial_js_basic_ops.html',1,'Basic Operations on Images']]], - ['operations_20on_20matrices_232',['Operations on Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'Arithm Operations on Matrices'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'Core Operations on Matrices']]], - ['operations_20on_20matrices_233',['Graph API: Operations on matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'']]], - ['operations_20on_20matrices_234',['Mask operations on matrices',['https://docs.opencv.org/4.2.0/d7/d37/tutorial_mat_mask_operations.html',1,'']]], - ['operations_20on_20matrices_235',['Operations on Matrices',['https://docs.opencv.org/4.2.0/d5/d8e/group__cudaarithm.html',1,'']]], - ['operations_20using_20inrange_236',['Thresholding Operations using inRange',['https://docs.opencv.org/4.2.0/da/d97/tutorial_threshold_inRange.html',1,'']]], - ['operations_20with_20images_237',['Operations with images',['https://docs.opencv.org/4.2.0/d5/d98/tutorial_mat_operations.html',1,'']]], - ['operations_2ehpp_238',['operations.hpp',['https://docs.opencv.org/4.2.0/d6/d00/operations_8hpp.html',1,'']]], - ['operator_239',['Laplace Operator',['https://docs.opencv.org/4.2.0/d5/db5/tutorial_laplace_operator.html',1,'']]], - ['operator_20_5fiterator_240',['operator _Iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a32d94193c6ac64834d75515fa2487695',1,'__gnu_debug::_Safe_iterator::operator _Iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a996c63351ba75c6b08c729662f1e2809',1,'__gnu_debug::_Safe_local_iterator::operator _Iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a32d94193c6ac64834d75515fa2487695',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator _Iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a32d94193c6ac64834d75515fa2487695',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator _Iterator()']]], - ['operator_20_5fraiter_241',['operator _RAIter',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#aaa63e1e4c5f2ad032d7deac8dbd8d2d6',1,'__gnu_parallel::_GuardedIterator']]], - ['operator_20_5ftp_20_2a_242',['operator _Tp *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#abf37a20ae4387196fe2a5684ced410dc',1,'cv::AutoBuffer']]], - ['operator_20affine3_3c_20y_20_3e_243',['operator Affine3< Y >',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a5828e816d1b22aef71ddacbdd364f68e',1,'cv::Affine3::operator Affine3< Y >()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a5828e816d1b22aef71ddacbdd364f68e',1,'Affine3< float >::operator Affine3< Y >()']]], - ['operator_20bool_244',['operator bool',['https://docs.opencv.org/4.2.0/d4/dd9/structcvv_1_1impl_1_1CallMetaData.html#ab98ed45df97d6e76f74ae6d89866b01b',1,'cvv::impl::CallMetaData::operator bool()'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a4258c9421f5dd3926779ac7a67051f92',1,'cv::GCompiled::operator bool()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ab7cd2f5971886fc2e4670c40abfa92c8',1,'cv::GStreamingCompiled::operator bool()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#acaf721831dbcc8a403f8c23b2515a9a3',1,'cv::util::optional::operator bool()'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#ab56e37ef0a460ea25aece5842fb4cd49',1,'cv::gapi::fluid::View::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_ios< char, _Traits >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_ios< char, _Traits >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_iostream< char >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_iostream< char >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_istream< char >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_istream< char >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_istream< char, _Traits >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_istream< char, _Traits >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_ostream< char >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_ostream< char >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_ostream< char, _Traits >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_ostream< char, _Traits >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_fstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_fstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ifstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ifstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ios::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ios::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_iostream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_iostream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_istream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_istream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02491.html#a9fa4ff4cc39750195997c8d7e5e800c6',1,'std::basic_istream::sentry::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_istringstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_istringstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ofstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ofstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ostream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ostream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02639.html#afb51ae0eb2883c81ff22e810e891be9f',1,'std::basic_ostream::sentry::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ostringstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ostringstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_stringstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_stringstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a2804a8e2d69cd03550a87d46d153c165',1,'std::function< _Res(_ArgTypes...)>::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#a98aca37a82eec323904e712571fa2ab1',1,'std::tr2::bool_set::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a9f21c10165ad856c5b6b2889b815a9bf',1,'std::unique_ptr::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a9e12d69878c17b4cbee312916f5b42e9',1,'std::unique_ptr< _Tp[], _Dp >::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a9f21c10165ad856c5b6b2889b815a9bf',1,'unique_ptr< _Codecvt >::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a9f21c10165ad856c5b6b2889b815a9bf',1,'unique_ptr< _Res_type >::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a9f21c10165ad856c5b6b2889b815a9bf',1,'unique_ptr< _Result< _Res > >::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a9f21c10165ad856c5b6b2889b815a9bf',1,'unique_ptr< _Result_base >::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a9f21c10165ad856c5b6b2889b815a9bf',1,'unique_ptr< bool[]>::operator bool()'],['../classrobot_1_1types_1_1DataPoint.html#a7bd06f1a8e8aa9a2b8c40a0f49aeb9b0',1,'robot::types::DataPoint::operator bool()']]], - ['operator_20bool_5ftype_245',['operator bool_type',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a056a9195ab28d22a0278b092901a2ced',1,'cv::cuda::Stream']]], - ['operator_20complex_3c_20t2_20_3e_246',['operator Complex< T2 >',['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#a4a96b4e23292e84682ff67435018c93c',1,'cv::Complex']]], - ['operator_20const_20_5ftp_20_2a_247',['operator const _Tp *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a8e1062498f5ea59f2784883cfd6607cb',1,'cv::AutoBuffer']]], - ['operator_20const_20double_20_2a_248',['operator const double *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a8e1062498f5ea59f2784883cfd6607cb',1,'AutoBuffer< double, 1 >::operator const double *()'],['https://docs.opencv.org/4.2.0/db/d28/structcv_1_1cudev_1_1DynamicSharedMem_3_01double_01_4.html#aa4a93c49320b0a583badf62a86e5ee32',1,'cv::cudev::DynamicSharedMem< double >::operator const double *()']]], - ['operator_20const_20int64_20_2a_249',['operator const int64 *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a8e1062498f5ea59f2784883cfd6607cb',1,'AutoBuffer< int64, 1 >']]], - ['operator_20const_20point_5fiterator_5f_250',['operator const point_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a3fba9aa69c338b7babd7a436ba0cf99f',1,'iterator_']]], - ['operator_20const_20string_20_2a_251',['operator const String *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a8e1062498f5ea59f2784883cfd6607cb',1,'AutoBuffer< String, 1 >']]], - ['operator_20cv_3a_3amat_20_26_252',['Mat &',['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a568312ced61a225000dd78283e8e22b3',1,'cv::detail::tracked_cv_mat']]], - ['operator_20cv_3a_3ascalar_20_26_253',['operator cv::Scalar &',['https://docs.opencv.org/4.2.0/d2/d64/structcv_1_1detail_1_1scalar__wrapper.html#a3f5d1f07562c64a4897698585f5b6d51',1,'cv::detail::scalar_wrapper::Scalar &()'],['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1detail_1_1scalar__wrapper__ocl.html#a07c6f422d5b3ab1664ae05a1d0983877',1,'cv::detail::scalar_wrapper_ocl::Scalar &()']]], - ['operator_20cv_3a_3aumat_20_26_254',['UMat &',['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a4120d3d2dbfc60ab25c942d8673aa985',1,'cv::detail::tracked_cv_umat']]], - ['operator_20double_255',['operator double',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae03480a1f0217c7bf9492f24f3a8d1b7',1,'cv::FileNode::operator double()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a5e3c36ffa74d7786313037c838c429eb',1,'cv::RNG::operator double()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a806b08b56c6b76a036bebc5a02a9145c',1,'cv::RNG_MT19937::operator double()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6193742b4bdb010eb9e5c91f106ca2e7',1,'cv::softdouble::operator double()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6193742b4bdb010eb9e5c91f106ca2e7',1,'operator double()(Global Namespace)']]], - ['operator_20double_20_2a_256',['operator double *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#abf37a20ae4387196fe2a5684ced410dc',1,'AutoBuffer< double, 1 >::operator double *()'],['https://docs.opencv.org/4.2.0/db/d28/structcv_1_1cudev_1_1DynamicSharedMem_3_01double_01_4.html#ab59da6e92a7641af49be147d5d342fe0',1,'cv::cudev::DynamicSharedMem< double >::operator double *()']]], - ['operator_20float_257',['operator float',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ace0c316a0f60a1b8bb66224363f2a5d0',1,'cv::FileNode::operator float()'],['https://docs.opencv.org/4.2.0/df/dc9/classcv_1_1float16__t.html#a528f90d01b978575b57836268e658401',1,'cv::float16_t::operator float()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a6c542e1c042c18b82ac447747445de9b',1,'cv::RNG::operator float()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a8d7f4f55d7cfac265cede2fafed93524',1,'cv::RNG_MT19937::operator float()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga977222074f9cbe76771c7864eeda3985',1,'cv::softfloat::operator float()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga977222074f9cbe76771c7864eeda3985',1,'operator float()(Global Namespace)']]], - ['operator_20gpcsamplesvector_20_26_258',['operator GPCSamplesVector &',['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#a94aaca04120126c35eebd20217a9d7dc',1,'cv::optflow::GPCTrainingSamples']]], - ['operator_20int64_20_2a_259',['operator int64 *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#abf37a20ae4387196fe2a5684ced410dc',1,'AutoBuffer< int64, 1 >']]], - ['operator_20mat_260',['operator Mat',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a14b681f8faccc92f32053ee037f22462',1,'cv::MatExpr']]], - ['operator_20mat_5f_3c_20_5ftp_20_3e_261',['operator Mat_< _Tp >',['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html#a3710f6457f9cad5e09397d9044e6167e',1,'cv::MatCommaInitializer_::operator Mat_< _Tp >()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a437838df79578365571e2253cb14ed18',1,'cv::MatExpr::operator Mat_< _Tp >()']]], - ['operator_20mat_5f_3c_20t2_20_3e_262',['operator Mat_< T2 >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a098ec36001b3998a7511e3c9169f93c8',1,'cv::Mat_::operator Mat_< T2 >()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a098ec36001b3998a7511e3c9169f93c8',1,'Mat_< double >::operator Mat_< T2 >()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a098ec36001b3998a7511e3c9169f93c8',1,'Mat_< float >::operator Mat_< T2 >()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a098ec36001b3998a7511e3c9169f93c8',1,'Mat_< uchar >::operator Mat_< T2 >()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a098ec36001b3998a7511e3c9169f93c8',1,'Mat_< unsigned char >::operator Mat_< T2 >()']]], - ['operator_20matx_3c_20_5ftp_2c_20m_2c_20n_20_3e_263',['operator Matx< _Tp, m, n >',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a75b1b5424cf014f00d8f06ba1818a5d8',1,'cv::Mat']]], - ['operator_20matx_3c_20t2_2c_20m_2c_20n_20_3e_264',['operator Matx< T2, m, n >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'cv::Matx::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< _Tp, cn, 1 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, 1, 3 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, 2, 2 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, 2, 3 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, 3, 3 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, 3, 4 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, 4, 4 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, cn, 1 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< float, 2, 3 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< float, 3, 3 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< float, cn, 1 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< float_type, 4, 4 >::operator Matx< T2, m, n >()']]], - ['operator_20matx_3c_20typename_20datatype_3c_20_5ftp_20_3e_3a_3achannel_5ftype_2c_20m_2c_20n_20_3e_265',['operator Matx< typename DataType< _Tp >::channel_type, m, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7f6403f29aa303ab065267c608280cb0',1,'cv::Mat_']]], - ['operator_20matx_3c_20typename_20datatype_3c_20double_20_3e_3a_3achannel_5ftype_2c_20m_2c_20n_20_3e_266',['operator Matx< typename DataType< double >::channel_type, m, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7f6403f29aa303ab065267c608280cb0',1,'Mat_< double >']]], - ['operator_20matx_3c_20typename_20datatype_3c_20float_20_3e_3a_3achannel_5ftype_2c_20m_2c_20n_20_3e_267',['operator Matx< typename DataType< float >::channel_type, m, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7f6403f29aa303ab065267c608280cb0',1,'Mat_< float >']]], - ['operator_20matx_3c_20typename_20datatype_3c_20uchar_20_3e_3a_3achannel_5ftype_2c_20m_2c_20n_20_3e_268',['operator Matx< typename DataType< uchar >::channel_type, m, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7f6403f29aa303ab065267c608280cb0',1,'Mat_< uchar >']]], - ['operator_20matx_3c_20typename_20datatype_3c_20unsigned_20char_20_3e_3a_3achannel_5ftype_2c_20m_2c_20n_20_3e_269',['operator Matx< typename DataType< unsigned char >::channel_type, m, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7f6403f29aa303ab065267c608280cb0',1,'Mat_< unsigned char >']]], - ['operator_20point3_5f_3c_20_5ftp2_20_3e_270',['operator Point3_< _Tp2 >',['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#ae6befd4f66748e3fde691cbbcbfe263e',1,'cv::Point3_']]], - ['operator_20point_5f_3c_20_5ftp2_20_3e_271',['operator Point_< _Tp2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3a768b66c0a0c744924cc88c14f2322a',1,'cv::Point_::operator Point_< _Tp2 >()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3a768b66c0a0c744924cc88c14f2322a',1,'Point_< double >::operator Point_< _Tp2 >()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3a768b66c0a0c744924cc88c14f2322a',1,'Point_< float >::operator Point_< _Tp2 >()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3a768b66c0a0c744924cc88c14f2322a',1,'Point_< int >::operator Point_< _Tp2 >()']]], - ['operator_20point_5fiterator_5f_272',['operator point_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#aa4c276572f3681c975c496b45962abdd',1,'iterator_']]], - ['operator_20ptrstep_3c_20_5ftp_20_3e_273',['operator PtrStep< _Tp >',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a8b0aa2f9bdf8b40f43be8d8068f2e389',1,'cv::cuda::GpuMat']]], - ['operator_20ptrstepsz_3c_20_5ftp_20_3e_274',['operator PtrStepSz< _Tp >',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a939f8ef4be2fc9a51058c2404d491f74',1,'cv::cuda::GpuMat']]], - ['operator_20rect_5f_3c_20_5ftp2_20_3e_275',['operator Rect_< _Tp2 >',['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#aede48baa3604b77b25b7cf05c070868f',1,'cv::Rect_']]], - ['operator_20result_5ftype_276',['operator result_type',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a84995c206ff9b0a5310ab1423fc9fd34',1,'cv::cudev::NormHamming::operator result_type()'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#a9dd8ad2fdeb5fa975ca5bf124de51851',1,'cv::cudev::NormL1::operator result_type()'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#ad56cf3e17aaa279d1d125d4e0767fbc1',1,'cv::cudev::NormL1< float >::operator result_type()'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#ac931d3d0abf115856d75b94e18db0b18',1,'cv::cudev::NormL2::operator result_type()']]], - ['operator_20scalar_5f_3c_20t2_20_3e_277',['operator Scalar_< T2 >',['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a80e2d82a29fc3de327c8c30343129d7c',1,'cv::Scalar_::operator Scalar_< T2 >()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a80e2d82a29fc3de327c8c30343129d7c',1,'Scalar_< double >::operator Scalar_< T2 >()']]], - ['operator_20schar_278',['operator schar',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a5f01fd132f75a87cc2ed153bf9907240',1,'cv::RNG']]], - ['operator_20short_279',['operator short',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#ac6584b40ce8f99260210bcac615bd1ed',1,'cv::RNG']]], - ['operator_20size_5f_3c_20_5ftp2_20_3e_280',['operator Size_< _Tp2 >',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2479ca9cf7100d03f2f8369c1ac3a6a1',1,'cv::Size_::operator Size_< _Tp2 >()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2479ca9cf7100d03f2f8369c1ac3a6a1',1,'Size_< float >::operator Size_< _Tp2 >()']]], - ['operator_20size_5ft_281',['operator size_t',['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#acccf0bdf7e1bbd3a9d327ef528cb5993',1,'cv::MatStep']]], - ['operator_20softdouble_282',['operator softdouble',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad15be60dda73c34e2d9c79f1d3c2ea34',1,'cv::softfloat::operator softdouble()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad15be60dda73c34e2d9c79f1d3c2ea34',1,'operator softdouble()(Global Namespace)']]], - ['operator_20softfloat_283',['operator softfloat',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga021a93447f30e43636141398859ccd6c',1,'cv::softdouble::operator softfloat()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga021a93447f30e43636141398859ccd6c',1,'operator softfloat()(Global Namespace)']]], - ['operator_20std_3a_3aarray_3c_20_5ftp_2c_20_5fnm_20_3e_284',['operator std::array< _Tp, _Nm >',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a3896b518731a7a1e9cbf59aef1168734',1,'cv::Mat::array< _Tp, _Nm >()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a682ac14db764b33ce1c29cee4b5fe608',1,'cv::Mat_::array< _Tp, _Nm >()']]], - ['operator_20std_3a_3aarray_3c_20double_2c_20_5fnm_20_3e_285',['array< double, _Nm >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a682ac14db764b33ce1c29cee4b5fe608',1,'Mat_< double >']]], - ['operator_20std_3a_3aarray_3c_20float_2c_20_5fnm_20_3e_286',['array< float, _Nm >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a682ac14db764b33ce1c29cee4b5fe608',1,'Mat_< float >']]], - ['operator_20std_3a_3aarray_3c_20uchar_2c_20_5fnm_20_3e_287',['array< uchar, _Nm >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a682ac14db764b33ce1c29cee4b5fe608',1,'Mat_< uchar >']]], - ['operator_20std_3a_3aarray_3c_20unsigned_20char_2c_20_5fnm_20_3e_288',['array< unsigned char, _Nm >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a682ac14db764b33ce1c29cee4b5fe608',1,'Mat_< unsigned char >']]], - ['operator_20std_3a_3astring_289',['operator std::string',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a11de5ea3c4d33e23d584112434852310',1,'cv::FileNode::string()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_ae9015c658f99cf3d48a8563accc79988.html#ae9015c658f99cf3d48a8563accc79988',1,'nlohmann::json_pointer::string()']]], - ['operator_20std_3a_3avector_3c_20_5ftp_20_3e_290',['operator std::vector< _Tp >',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a5d043937e7a4cad632397a9dd8dfee2e',1,'cv::Mat::vector< _Tp >()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a2c3031911a3a2140becb9a4b7dbb1d21',1,'cv::Mat_::vector< _Tp >()']]], - ['operator_20std_3a_3avector_3c_20double_20_3e_291',['vector< double >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a2c3031911a3a2140becb9a4b7dbb1d21',1,'Mat_< double >']]], - ['operator_20std_3a_3avector_3c_20float_20_3e_292',['vector< float >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a2c3031911a3a2140becb9a4b7dbb1d21',1,'Mat_< float >']]], - ['operator_20std_3a_3avector_3c_20uchar_20_3e_293',['vector< uchar >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a2c3031911a3a2140becb9a4b7dbb1d21',1,'Mat_< uchar >']]], - ['operator_20std_3a_3avector_3c_20unsigned_20char_20_3e_294',['vector< unsigned char >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a2c3031911a3a2140becb9a4b7dbb1d21',1,'Mat_< unsigned char >']]], - ['operator_20streamoff_295',['operator streamoff',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a7da1f1b28792e35537bec6d1bc4feb88',1,'std::fpos']]], - ['operator_20string_20_2a_296',['operator String *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#abf37a20ae4387196fe2a5684ced410dc',1,'AutoBuffer< String, 1 >']]], - ['operator_20string_5ftype_297',['operator string_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#aaa88132502a374183f5de838441b9002',1,'std::sub_match::operator string_type()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#aaa88132502a374183f5de838441b9002',1,'sub_match< _Bi_iter >::operator string_type()']]], - ['operator_20t_298',['operator T',['../classrobot_1_1types_1_1DataPoint.html#add5401ce0832af2752f634f80c44c7be',1,'robot::types::DataPoint']]], - ['operator_20uchar_299',['operator uchar',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a8b1a6322d1cac24cd929aecad1041f22',1,'cv::RNG']]], - ['operator_20unsigned_300',['operator unsigned',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a8419e63b25666f77d2d388aaae8122ba',1,'cv::RNG::operator unsigned()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a31e2bc86ef08ccb268a10101ee0ccbbf',1,'cv::RNG_MT19937::operator unsigned()']]], - ['operator_20ushort_301',['operator ushort',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a51e4c416b3ace4840774cceaedcc4b9a',1,'cv::RNG']]], - ['operator_20value_5ft_302',['operator value_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6d4b8df10ecc533a50823e8805f4a873.html#a6d4b8df10ecc533a50823e8805f4a873',1,'nlohmann::basic_json']]], - ['operator_20valuetype_303',['operator ValueType',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ada1463d8d7ba77865f28f5e83dec7f33.html#ada1463d8d7ba77865f28f5e83dec7f33',1,'nlohmann::basic_json']]], - ['operator_20vec3b_304',['operator Vec3b',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#af5807af9aefd3b74c7feab6544828bec',1,'cv::viz::Color']]], - ['operator_20vec_3c_20_5ftp_2c_202_20_3e_305',['operator Vec< _Tp, 2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a625700af6b447b0803907dc6d845a6b4',1,'cv::Point_']]], - ['operator_20vec_3c_20_5ftp_2c_203_20_3e_306',['operator Vec< _Tp, 3 >',['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a13bc76b8cadfd7a7bc903fd8a8be6167',1,'cv::Point3_']]], - ['operator_20vec_3c_20_5ftp_2c_20n_20_3e_307',['operator Vec< _Tp, n >',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ae4766cf75071f4e4db698c4120abe57b',1,'cv::Mat']]], - ['operator_20vec_3c_20double_2c_202_20_3e_308',['operator Vec< double, 2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a625700af6b447b0803907dc6d845a6b4',1,'Point_< double >']]], - ['operator_20vec_3c_20float_2c_202_20_3e_309',['operator Vec< float, 2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a625700af6b447b0803907dc6d845a6b4',1,'Point_< float >']]], - ['operator_20vec_3c_20t2_2c_20cn_20_3e_310',['operator Vec< T2, cn >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'cv::Vec::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< _Tp, 4 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, 2 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, 3 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, 4 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, nFeatures >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< float, 2 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< float, 3 >::operator Vec< T2, cn >()']]], - ['operator_20vec_3c_20typename_20datatype_3c_20_5ftp_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_311',['operator Vec< typename DataType< _Tp >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'cv::Mat_']]], - ['operator_20vec_3c_20typename_20datatype_3c_20double_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_312',['operator Vec< typename DataType< double >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< double >']]], - ['operator_20vec_3c_20typename_20datatype_3c_20float_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_313',['operator Vec< typename DataType< float >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< float >']]], - ['operator_20vec_3c_20typename_20datatype_3c_20uchar_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_314',['operator Vec< typename DataType< uchar >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< uchar >']]], - ['operator_20vec_3c_20typename_20datatype_3c_20unsigned_20char_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_315',['operator Vec< typename DataType< unsigned char >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< unsigned char >']]], - ['operator_21_316',['operator!',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ios< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ios< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_iostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_iostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_fstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_fstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ifstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ifstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ios::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ios::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_iostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_iostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ofstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ofstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_stringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_stringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8ae9cabed8e455713324dacd39bedef1',1,'std::valarray::operator!()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8ae9cabed8e455713324dacd39bedef1',1,'valarray< size_t >::operator!()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedd36c90ccd8d1c8ea0d9d121764687e',1,'cv::cudev::operator!(const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a99111955fe2272dece21813539289',1,'cv::cudev::operator!(const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691ce9b6cae1134cdbf39a5ac37ffbc6',1,'cv::cudev::operator!(const Expr< Body > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad387b8de401308ad8764356a902294d4',1,'cv::cudev::operator!(const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga096854f6b69712bd3a6b08b240b390d8',1,'cv::cudev::operator!(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4d6a028a6b6192bf17c25ca75d7f84',1,'cv::cudev::operator!(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2bc16d5e23552ba6fd31b1912fa4a6f',1,'cv::cudev::operator!(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2f274425168b4133ef5270b0ddae7ae',1,'cv::cudev::operator!(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd37e74306bce3962b9b081db9c6064a',1,'cv::cudev::operator!(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38aa67c0f1b4dc9ebe976cdbb2c45771',1,'cv::cudev::operator!(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a32684d4325c9ac27aa698b23ee0ab',1,'cv::cudev::operator!(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6a772b81ca9afc60e6d06f37443b48f',1,'cv::cudev::operator!(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15b5f3146f6815ccfaa75b313cf1bece',1,'cv::cudev::operator!(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa86526fb4e3341ae51d619b0db2cd379',1,'cv::cudev::operator!(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadca17a33d6f1d4b7c85834a156859940',1,'cv::cudev::operator!(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5072fb2fd15a0e93d7cda0cd295bc894',1,'cv::cudev::operator!(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1938b6ba569496387172de1db0a90a9',1,'cv::cudev::operator!(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga710384a11224d911dc1c06966407b070',1,'cv::cudev::operator!(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4575777615eafb52b138f3f70332fcad',1,'cv::cudev::operator!(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66daea7b4632dffed59485b06e850135',1,'cv::cudev::operator!(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41d458a2f3eb470ef98348bc8dcaeec7',1,'cv::cudev::operator!(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga285b3d30ef7b1b1dcf391e62f0a7ab84',1,'cv::cudev::operator!(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ad51bb71a9827aba1389f15aecaf666',1,'cv::cudev::operator!(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48732936efbae4811ff6bd0a5fa6e018',1,'cv::cudev::operator!(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef97c1bdfbf913fbcb909c9014bf2bd0',1,'cv::cudev::operator!(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a5369d6b2d681d7d61226ab28986a19',1,'cv::cudev::operator!(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55a6f14fd6c882ece5bbbeb8633c9191',1,'cv::cudev::operator!(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfd535749b1c35f92e47e69cab7d08af',1,'cv::cudev::operator!(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b788e3270d0fc245b0566f01415334f',1,'cv::cudev::operator!(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9faa344cc89c3f9896d763e4fa9bb9a4',1,'cv::cudev::operator!(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafef7c2b87b9ce254712c0628519895a5',1,'cv::cudev::operator!(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5414c9eaf8734e95201f4485b744d3b2',1,'cv::cudev::operator!(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0314d3c8d73359a7ce7e39c43ed67568',1,'cv::cudev::operator!(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4d8cc9fe8152f04f27ef3f65eb37db1',1,'cv::cudev::operator!(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d66ce3b8d478e84d239d1f28fcf1cf',1,'cv::cudev::operator!(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca58de1b50f1b0f27f31afa3c1a0082e',1,'cv::cudev::operator!(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedd36c90ccd8d1c8ea0d9d121764687e',1,'operator!(const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a99111955fe2272dece21813539289',1,'operator!(const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691ce9b6cae1134cdbf39a5ac37ffbc6',1,'operator!(const Expr< Body > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad387b8de401308ad8764356a902294d4',1,'operator!(const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga096854f6b69712bd3a6b08b240b390d8',1,'operator!(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4d6a028a6b6192bf17c25ca75d7f84',1,'operator!(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2bc16d5e23552ba6fd31b1912fa4a6f',1,'operator!(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2f274425168b4133ef5270b0ddae7ae',1,'operator!(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd37e74306bce3962b9b081db9c6064a',1,'operator!(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38aa67c0f1b4dc9ebe976cdbb2c45771',1,'operator!(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a32684d4325c9ac27aa698b23ee0ab',1,'operator!(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6a772b81ca9afc60e6d06f37443b48f',1,'operator!(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15b5f3146f6815ccfaa75b313cf1bece',1,'operator!(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa86526fb4e3341ae51d619b0db2cd379',1,'operator!(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadca17a33d6f1d4b7c85834a156859940',1,'operator!(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5072fb2fd15a0e93d7cda0cd295bc894',1,'operator!(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1938b6ba569496387172de1db0a90a9',1,'operator!(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga710384a11224d911dc1c06966407b070',1,'operator!(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4575777615eafb52b138f3f70332fcad',1,'operator!(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66daea7b4632dffed59485b06e850135',1,'operator!(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41d458a2f3eb470ef98348bc8dcaeec7',1,'operator!(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga285b3d30ef7b1b1dcf391e62f0a7ab84',1,'operator!(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ad51bb71a9827aba1389f15aecaf666',1,'operator!(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48732936efbae4811ff6bd0a5fa6e018',1,'operator!(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef97c1bdfbf913fbcb909c9014bf2bd0',1,'operator!(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a5369d6b2d681d7d61226ab28986a19',1,'operator!(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55a6f14fd6c882ece5bbbeb8633c9191',1,'operator!(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfd535749b1c35f92e47e69cab7d08af',1,'operator!(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b788e3270d0fc245b0566f01415334f',1,'operator!(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9faa344cc89c3f9896d763e4fa9bb9a4',1,'operator!(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafef7c2b87b9ce254712c0628519895a5',1,'operator!(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5414c9eaf8734e95201f4485b744d3b2',1,'operator!(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0314d3c8d73359a7ce7e39c43ed67568',1,'operator!(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4d8cc9fe8152f04f27ef3f65eb37db1',1,'operator!(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d66ce3b8d478e84d239d1f28fcf1cf',1,'operator!(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca58de1b50f1b0f27f31afa3c1a0082e',1,'operator!(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8ae9cabed8e455713324dacd39bedef1',1,'operator!() const(Global Namespace)']]], - ['operator_21_3d_317',['operator!=',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a224780d14e4f8aae3e6127d605736bd1',1,'cv::FileNodeIterator::operator!=(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a224780d14e4f8aae3e6127d605736bd1',1,'cv::FileNodeIterator::operator!=(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a6b16d9a0f3bb63fa355a63a05a5fd397',1,'cv::GMatDesc::operator!=()'],['https://docs.opencv.org/4.2.0/d1/d6a/structcv_1_1GScalarDesc.html#a7aa7e15af456abb71d568281f4148781',1,'cv::GScalarDesc::operator!=()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a89ee700214e5c588fc9c2f16dc5f0814',1,'cv::MatExpr::operator!=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0c7b11e74936908ee2fb47e4eb9c5e18',1,'cv::MatExpr::operator!=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a25f71801b3fb6ab5395c2dbcc9cc60ad',1,'cv::MatExpr::operator!=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a76d099d1e862f773c3f0d234b2261feb',1,'cv::MatExpr::operator!=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7105f56350ad1d16b716a3664edbd7f5',1,'cv::MatExpr::operator!=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a89ee700214e5c588fc9c2f16dc5f0814',1,'cv::MatExpr::operator!=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0c7b11e74936908ee2fb47e4eb9c5e18',1,'cv::MatExpr::operator!=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a25f71801b3fb6ab5395c2dbcc9cc60ad',1,'cv::MatExpr::operator!=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a76d099d1e862f773c3f0d234b2261feb',1,'cv::MatExpr::operator!=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7105f56350ad1d16b716a3664edbd7f5',1,'cv::MatExpr::operator!=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#af0917c4e9713001260d67db171256a93',1,'cv::MatSize::operator!=()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'cv::Matx::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'cv::Matx::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< _Tp, cn, 1 >::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< _Tp, cn, 1 >::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 1, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 1, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 2 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 2 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 4, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 4, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, cn, 1 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, cn, 1 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 2, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 2, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 3, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 3, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, cn, 1 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, cn, 1 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float_type, 4, 4 >::operator!=(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float_type, 4, 4 >::operator!=(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3e6d2ce9ae1fc533c68737efecdd1b5b',1,'cv::softdouble::operator!=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafa7691dc904caca8588ea6a4b0954e08',1,'cv::softfloat::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#af00d0999bd1cb1c6a731bf5327caea72',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#af00d0999bd1cb1c6a731bf5327caea72',1,'__gnu_pbds::detail::bin_search_tree_node_it_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#ade2fe116ea5d8252d04e3205d8a097f5',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator!=(const binary_heap_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#ac2a94a28e8beb3b3b2e66632636930f9',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator!=(const binary_heap_point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#ac2a94a28e8beb3b3b2e66632636930f9',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#aa943274d090a3ccb2e74e2937ac00e13',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator!=(const left_child_next_sibling_heap_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#ad5876d650788d02f01035cdb3040dd88',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator!=(const left_child_next_sibling_heap_node_point_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#ad5876d650788d02f01035cdb3040dd88',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a210f5b96aa65b4a025d3f4998378862f',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a210f5b96aa65b4a025d3f4998378862f',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a40cf56640357123e880f39e36454b552',1,'const_iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5b0ebe0ad2f13fb20de8c5cff2855216',1,'const_iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a40cf56640357123e880f39e36454b552',1,'iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5b0ebe0ad2f13fb20de8c5cff2855216',1,'iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a40cf56640357123e880f39e36454b552',1,'point_const_iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5b0ebe0ad2f13fb20de8c5cff2855216',1,'point_const_iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#ae8c663552f5380496391513e71799847',1,'point_iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a0b828d52a1d27c8e786c7171a65bff97',1,'point_iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05507.html#a0ace445834d8a331ce293f4e3214b591',1,'std::_Fwd_list_const_iterator::operator!='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05503.html#a0ace445834d8a331ce293f4e3214b591',1,'std::_Fwd_list_iterator::operator!='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa69e1223ce6dc3f69fd44cc331bb170e',1,'std::bitset::operator!=(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa69e1223ce6dc3f69fd44cc331bb170e',1,'std::bitset::operator!=(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#adbf547d835746748a205bb57fd81a43f',1,'std::locale::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a2ec683d37e64edce2bea9366a5415677',1,'std::regex_iterator::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a6446149296f14aee3eef4ac516a96f52',1,'std::regex_token_iterator::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a028c7ac8094d610042fd0f9feca68f63',1,'Eigen::MatrixBase::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a028c7ac8094d610042fd0f9feca68f63',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a028c7ac8094d610042fd0f9feca68f63',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'Eigen::QuaternionBase::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator!=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6e2e21da48f5d9471716cd868a068327.html#a6e2e21da48f5d9471716cd868a068327',1,'nlohmann::basic_json::operator!='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4d581dc2ab78091885f9af24d13749dc.html#a4d581dc2ab78091885f9af24d13749dc',1,'nlohmann::basic_json::operator!='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa9861979059799375c0fff68174610ba.html#aa9861979059799375c0fff68174610ba',1,'nlohmann::basic_json::operator!='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a760bf39cc5477bc663d8bb3c44aabf6a.html#a760bf39cc5477bc663d8bb3c44aabf6a',1,'nlohmann::byte_container_with_subtype::operator!=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a6779edcf28e6f018a3bbb29c0b4b5e1e.html#a6779edcf28e6f018a3bbb29c0b4b5e1e',1,'nlohmann::json_pointer::operator!='],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacfed05378c432f84c46e3a2e80e321e8',1,'cv::operator!=()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8292fe7dc983ee976f9f112bcb9b6c1d',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7d957663c54fb266f22662e02d515a0',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga134eff23af476bb078268d470c5a1eab',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30827c997d70e1ec669dfe661188bf97',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a85ae32eae025d733fb5e3ef556bf1a',1,'cv::cudev::operator!=(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b6fc14c39892e90df1b408a88f4a89',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae195999272c703fd97df7a3b66e061c1',1,'cv::cudev::operator!=(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a70181a870d6be3b2045a194b2ba0a3',1,'cv::cudev::operator!=(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0433dbcd94c2e678a7c1938c24ee08da',1,'cv::cudev::operator!=(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26dbfbf9dc0e5fc90b82f41229c84899',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1efe076c9144b56c61e17b96fa6e210e',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e37d9a1418a94d91adf91c477519144',1,'cv::cudev::operator!=(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa35d062549d2cfa7d9841e1ac7799a44',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f22949e60450f64d1b3c459de0e7a27',1,'cv::cudev::operator!=(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71df1ef74ebec36966335c1b5449a07b',1,'cv::cudev::operator!=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51b3e383f16f20dc1928d89f4524bce',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a34b56e3225c861848f01b4e3b1c44a',1,'cv::cudev::operator!=(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61134a26d4c0e5ca4467638109358eaa',1,'cv::cudev::operator!=(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac01068a2f43c82f8e14d0ac68996c903',1,'cv::cudev::operator!=(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00b76efa5a61126d47883ddbf36799f0',1,'cv::cudev::operator!=(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1a88913cdea995341a95e23135b06bf',1,'cv::cudev::operator!=(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa295a03a44435b12c5b2ce66bf4c1d8d',1,'cv::cudev::operator!=(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba8ae9e88782d3b46baa0cd308b594ca',1,'cv::cudev::operator!=(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc15d3d94c1bf3032fa82162cd5d08c2',1,'cv::cudev::operator!=(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bbfb03a53e5581effe1f9f98d30873',1,'cv::cudev::operator!=(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35e7a1277bb5d5249c578b0a289f4a5b',1,'cv::cudev::operator!=(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2cfd0dba2d83f0dd7e267fb537c6df3',1,'cv::cudev::operator!=(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga904fe1a365ccf3f52ded833f98ab4c1d',1,'cv::cudev::operator!=(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27dfb14836d9f082e79d9a804291564',1,'cv::cudev::operator!=(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c715a1f404a93f452cd718cd61822ef',1,'cv::cudev::operator!=(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1196cca16594f3ca574ffae1e94e7b1',1,'cv::cudev::operator!=(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2540630d91b7767930621ce3c6fd76e1',1,'cv::cudev::operator!=(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb08af5c7f389e522b5822a4ed2f9461',1,'cv::cudev::operator!=(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23c79a1928e13afc502bb8b7f331e430',1,'cv::cudev::operator!=(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc40e9339bd3ac67fd8cbd5b027e18d',1,'cv::cudev::operator!=(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f3ae663608af22f0c147d4d1c0cec9b',1,'cv::cudev::operator!=(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4dfd8489e7ec481cbe03b56039599e',1,'cv::cudev::operator!=(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae80f5e0d14e29c9a5505deee930a41d7',1,'cv::cudev::operator!=(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad791250abb63d31f2fd906d838f3994a',1,'cv::cudev::operator!=(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ce12579d99d81239384b64b528d9e67',1,'cv::cudev::operator!=(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ddfdc36315c9e7eae56b412d83b0a05',1,'cv::cudev::operator!=(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga781786668348ca67ef6fc9f333fd76bd',1,'cv::cudev::operator!=(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32d5f8d24bdce45881f83215c243ed9d',1,'cv::cudev::operator!=(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ba755d444526c74046317135fdc2f06',1,'cv::cudev::operator!=(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga018afdf83525378f4fb0e87057ddd12c',1,'cv::cudev::operator!=(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fbf5e5e077bbe431d43e5dfc3199595',1,'cv::cudev::operator!=(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a74d8b5cff07e001fa59b0bdf4bdc8',1,'cv::cudev::operator!=(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7e2f8cdd7843ea8e78f8c1e4c69df0b',1,'cv::cudev::operator!=(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d3a7254a567bbb65a400e55dd85ff93',1,'cv::cudev::operator!=(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0e2aaffe5179188a45b52ed7d05b665',1,'cv::cudev::operator!=(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa416b9a794190e20a62b08cde74fa95c',1,'cv::cudev::operator!=(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06e89f04ab74961a37ba14c5e2f84832',1,'cv::cudev::operator!=(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga059791beca5a629072a39a00978f4a7f',1,'cv::cudev::operator!=(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d61cb0c52994efdf53d7c912582bf8b',1,'cv::cudev::operator!=(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7bcfb20794a46293a7d4e7301b44f7',1,'cv::cudev::operator!=(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02ef404a904a3ec832c9add12935eacc',1,'cv::cudev::operator!=(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14e0dc7340bf0380c8e7ff3b6ad61d8d',1,'cv::cudev::operator!=(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35c3b84bb03b81839a2c3e9c1055a80f',1,'cv::cudev::operator!=(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7f1eaafa2eba2a41778d32070a3a2a',1,'cv::cudev::operator!=(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba5e0f75bf2cc2fd562e3df677ea694',1,'cv::cudev::operator!=(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae703f571d189f59c10ac1b776fb51404',1,'cv::cudev::operator!=(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a865177e087ade5119108ad893fc40',1,'cv::cudev::operator!=(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f332aaeee915649e3ba300bfd6e0862',1,'cv::cudev::operator!=(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f549d8efea1133b101ffce070bf7bb1',1,'cv::cudev::operator!=(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3dc461d11161c9c0269d007f9c0664',1,'cv::cudev::operator!=(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301514bbd97b257d879b7b956231618d',1,'cv::cudev::operator!=(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f6246f3563a2788bdab0ffd43946a28',1,'cv::cudev::operator!=(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27c5affcafc4dfbaa5bd97878a85805',1,'cv::cudev::operator!=(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0cda31d15dbbaad26ee24e31deaeb0',1,'cv::cudev::operator!=(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab81a1eee4dcf637837acd349d99bc9',1,'cv::cudev::operator!=(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeac8a5773046490bb3e174f794f9a3bf',1,'cv::cudev::operator!=(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbb8eef6cbff069ea514a1d08d1c1acc',1,'cv::cudev::operator!=(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c79714df94e4874571a6f6fbe802261',1,'cv::cudev::operator!=(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92977e9cd4b8299c7b4193be69e38140',1,'cv::cudev::operator!=(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade3a83bdc7ef86bfdbf599502d46baca',1,'cv::cudev::operator!=(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga770fa7102571a71eecff41db456a32a0',1,'cv::cudev::operator!=(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16f17453bfe07cca9818f9e8b3934955',1,'cv::cudev::operator!=(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37bc7a2403de26ee46a764916836e73',1,'cv::cudev::operator!=(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafaf36c9bcfe7c72a427dfaac657e291d',1,'cv::cudev::operator!=(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadad41dbc0aece9daa78fcf41a69673de',1,'cv::cudev::operator!=(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cb807429ac3b09197050a95728f556a',1,'cv::cudev::operator!=(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba1495d7b1d080f397329f02159c01e',1,'cv::cudev::operator!=(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9baa29316abd1f38a665c6cbc8cacab7',1,'cv::cudev::operator!=(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7603a241df59c649cc55105a1628df',1,'cv::cudev::operator!=(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195211f7ce1c4f3d67db531c2831f724',1,'cv::cudev::operator!=(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41419f07a921918f0701c998a8d76fb',1,'cv::cudev::operator!=(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae089ee9fd05ad99eebf886d55bfe7152',1,'cv::cudev::operator!=(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5dbacd27f428cce7bc009baf93a731f8',1,'cv::cudev::operator!=(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ca3d062d928c0f22cac521b71d9531a',1,'cv::cudev::operator!=(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e9806f1e89dded32d75e063645de53',1,'cv::cudev::operator!=(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e5d5b6b33702c5f4049358633041d36',1,'cv::cudev::operator!=(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga831de1ee68dbe4cabe2785d3b4ee4823',1,'cv::cudev::operator!=(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae125433024aa211123e58c04f034c750',1,'cv::cudev::operator!=(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c10e74e42a3199d23aacd569ecbdf3f',1,'cv::cudev::operator!=(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99fea0f04ddb67c943effb33762e48d',1,'cv::cudev::operator!=(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f4f66d6868e12eaccee9521e2751810',1,'cv::cudev::operator!=(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga358969872ca6b79e0c141bd4682085df',1,'cv::cudev::operator!=(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga300d7581d3c1bc8213d2690878045735',1,'cv::cudev::operator!=(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25c43cc94bc4759b75116adfe773f496',1,'cv::cudev::operator!=(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51077c5df4c6a888b84142e1af07b23',1,'cv::cudev::operator!=(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb9347618d1909b4307d5f5e8d5e0ec1',1,'cv::cudev::operator!=(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70e9295c70897f7ee8f165b2b9b92006',1,'cv::cudev::operator!=(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7816e638f08658a7127889f8924d463a',1,'cv::cudev::operator!=(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec66007c1a31dcf3aa21addda8d2e057',1,'cv::cudev::operator!=(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5df23018756bf58482b48b72f91c69',1,'cv::cudev::operator!=(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9f59dd31ae3f09e713717a052fb2d41',1,'cv::cudev::operator!=(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2edb4f9db0181f0ed159c100272de19e',1,'cv::cudev::operator!=(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14cc69402191ad1a9fadafc1797e4e5',1,'cv::cudev::operator!=(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefc9c61d220f8a87a7c07e07a1de92ef',1,'cv::cudev::operator!=(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c1259a165b16ae5e1a2e7582dc6ca19',1,'cv::cudev::operator!=(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27400033a8ccdaf73828d9569ab1d11f',1,'cv::cudev::operator!=(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64ebcee14a400f7d929e78336d556f76',1,'cv::cudev::operator!=(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c2fc1b7beb65f98f4f60313e89892',1,'cv::cudev::operator!=(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd4ea537ef260913359d331676ee41',1,'cv::cudev::operator!=(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d16922ec836552a427512b69378cea5',1,'cv::cudev::operator!=(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23335c5da9c49fc7fad795f8151ed17e',1,'cv::cudev::operator!=(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e6ecff1ed67f5619c81d15d6c61d2aa',1,'cv::cudev::operator!=(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d04608dbf78c558bbc9fe3157c1fa03',1,'cv::cudev::operator!=(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2b7ac6b676b027054f92659fcbd62b3',1,'cv::cudev::operator!=(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1074c3499e6d2197ec635fb11e013f59',1,'cv::cudev::operator!=(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#ad56f6fcb23f2a9cfb755740235424a11',1,'cv::gapi::operator!=()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a1fd873abaeb604fdbf9e008118552f6e',1,'cv::gapi::own::operator!=(const Rect &lhs, const Rect &rhs)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a9afb185df936f93b5388f549a463e618',1,'cv::gapi::own::operator!=(const Size &lhs, const Size &rhs)'],['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#a026ad4480a333be3a691a7c7311da00b',1,'cv::tbm::operator!=()'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#aefce3a0692acbbc03674218a59ded1bc',1,'cv::util::operator!=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafa7691dc904caca8588ea6a4b0954e08',1,'operator!=(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3e6d2ce9ae1fc533c68737efecdd1b5b',1,'operator!=(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacfed05378c432f84c46e3a2e80e321e8',1,'operator!=(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8292fe7dc983ee976f9f112bcb9b6c1d',1,'operator!=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7d957663c54fb266f22662e02d515a0',1,'operator!=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga134eff23af476bb078268d470c5a1eab',1,'operator!=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30827c997d70e1ec669dfe661188bf97',1,'operator!=(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a85ae32eae025d733fb5e3ef556bf1a',1,'operator!=(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b6fc14c39892e90df1b408a88f4a89',1,'operator!=(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae195999272c703fd97df7a3b66e061c1',1,'operator!=(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a70181a870d6be3b2045a194b2ba0a3',1,'operator!=(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0433dbcd94c2e678a7c1938c24ee08da',1,'operator!=(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26dbfbf9dc0e5fc90b82f41229c84899',1,'operator!=(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1efe076c9144b56c61e17b96fa6e210e',1,'operator!=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e37d9a1418a94d91adf91c477519144',1,'operator!=(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa35d062549d2cfa7d9841e1ac7799a44',1,'operator!=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f22949e60450f64d1b3c459de0e7a27',1,'operator!=(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71df1ef74ebec36966335c1b5449a07b',1,'operator!=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51b3e383f16f20dc1928d89f4524bce',1,'operator!=(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a34b56e3225c861848f01b4e3b1c44a',1,'operator!=(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61134a26d4c0e5ca4467638109358eaa',1,'operator!=(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac01068a2f43c82f8e14d0ac68996c903',1,'operator!=(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00b76efa5a61126d47883ddbf36799f0',1,'operator!=(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1a88913cdea995341a95e23135b06bf',1,'operator!=(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa295a03a44435b12c5b2ce66bf4c1d8d',1,'operator!=(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba8ae9e88782d3b46baa0cd308b594ca',1,'operator!=(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc15d3d94c1bf3032fa82162cd5d08c2',1,'operator!=(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bbfb03a53e5581effe1f9f98d30873',1,'operator!=(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35e7a1277bb5d5249c578b0a289f4a5b',1,'operator!=(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2cfd0dba2d83f0dd7e267fb537c6df3',1,'operator!=(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga904fe1a365ccf3f52ded833f98ab4c1d',1,'operator!=(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27dfb14836d9f082e79d9a804291564',1,'operator!=(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c715a1f404a93f452cd718cd61822ef',1,'operator!=(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1196cca16594f3ca574ffae1e94e7b1',1,'operator!=(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2540630d91b7767930621ce3c6fd76e1',1,'operator!=(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb08af5c7f389e522b5822a4ed2f9461',1,'operator!=(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23c79a1928e13afc502bb8b7f331e430',1,'operator!=(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc40e9339bd3ac67fd8cbd5b027e18d',1,'operator!=(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f3ae663608af22f0c147d4d1c0cec9b',1,'operator!=(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4dfd8489e7ec481cbe03b56039599e',1,'operator!=(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae80f5e0d14e29c9a5505deee930a41d7',1,'operator!=(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad791250abb63d31f2fd906d838f3994a',1,'operator!=(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ce12579d99d81239384b64b528d9e67',1,'operator!=(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ddfdc36315c9e7eae56b412d83b0a05',1,'operator!=(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga781786668348ca67ef6fc9f333fd76bd',1,'operator!=(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32d5f8d24bdce45881f83215c243ed9d',1,'operator!=(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ba755d444526c74046317135fdc2f06',1,'operator!=(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga018afdf83525378f4fb0e87057ddd12c',1,'operator!=(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fbf5e5e077bbe431d43e5dfc3199595',1,'operator!=(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a74d8b5cff07e001fa59b0bdf4bdc8',1,'operator!=(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7e2f8cdd7843ea8e78f8c1e4c69df0b',1,'operator!=(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d3a7254a567bbb65a400e55dd85ff93',1,'operator!=(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0e2aaffe5179188a45b52ed7d05b665',1,'operator!=(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa416b9a794190e20a62b08cde74fa95c',1,'operator!=(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06e89f04ab74961a37ba14c5e2f84832',1,'operator!=(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga059791beca5a629072a39a00978f4a7f',1,'operator!=(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d61cb0c52994efdf53d7c912582bf8b',1,'operator!=(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7bcfb20794a46293a7d4e7301b44f7',1,'operator!=(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02ef404a904a3ec832c9add12935eacc',1,'operator!=(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14e0dc7340bf0380c8e7ff3b6ad61d8d',1,'operator!=(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35c3b84bb03b81839a2c3e9c1055a80f',1,'operator!=(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7f1eaafa2eba2a41778d32070a3a2a',1,'operator!=(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba5e0f75bf2cc2fd562e3df677ea694',1,'operator!=(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae703f571d189f59c10ac1b776fb51404',1,'operator!=(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a865177e087ade5119108ad893fc40',1,'operator!=(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f332aaeee915649e3ba300bfd6e0862',1,'operator!=(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f549d8efea1133b101ffce070bf7bb1',1,'operator!=(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3dc461d11161c9c0269d007f9c0664',1,'operator!=(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301514bbd97b257d879b7b956231618d',1,'operator!=(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f6246f3563a2788bdab0ffd43946a28',1,'operator!=(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27c5affcafc4dfbaa5bd97878a85805',1,'operator!=(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0cda31d15dbbaad26ee24e31deaeb0',1,'operator!=(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab81a1eee4dcf637837acd349d99bc9',1,'operator!=(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeac8a5773046490bb3e174f794f9a3bf',1,'operator!=(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbb8eef6cbff069ea514a1d08d1c1acc',1,'operator!=(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c79714df94e4874571a6f6fbe802261',1,'operator!=(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92977e9cd4b8299c7b4193be69e38140',1,'operator!=(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade3a83bdc7ef86bfdbf599502d46baca',1,'operator!=(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga770fa7102571a71eecff41db456a32a0',1,'operator!=(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16f17453bfe07cca9818f9e8b3934955',1,'operator!=(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37bc7a2403de26ee46a764916836e73',1,'operator!=(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafaf36c9bcfe7c72a427dfaac657e291d',1,'operator!=(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadad41dbc0aece9daa78fcf41a69673de',1,'operator!=(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cb807429ac3b09197050a95728f556a',1,'operator!=(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba1495d7b1d080f397329f02159c01e',1,'operator!=(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9baa29316abd1f38a665c6cbc8cacab7',1,'operator!=(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7603a241df59c649cc55105a1628df',1,'operator!=(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195211f7ce1c4f3d67db531c2831f724',1,'operator!=(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41419f07a921918f0701c998a8d76fb',1,'operator!=(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae089ee9fd05ad99eebf886d55bfe7152',1,'operator!=(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5dbacd27f428cce7bc009baf93a731f8',1,'operator!=(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ca3d062d928c0f22cac521b71d9531a',1,'operator!=(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e9806f1e89dded32d75e063645de53',1,'operator!=(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e5d5b6b33702c5f4049358633041d36',1,'operator!=(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga831de1ee68dbe4cabe2785d3b4ee4823',1,'operator!=(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae125433024aa211123e58c04f034c750',1,'operator!=(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c10e74e42a3199d23aacd569ecbdf3f',1,'operator!=(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99fea0f04ddb67c943effb33762e48d',1,'operator!=(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f4f66d6868e12eaccee9521e2751810',1,'operator!=(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga358969872ca6b79e0c141bd4682085df',1,'operator!=(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga300d7581d3c1bc8213d2690878045735',1,'operator!=(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25c43cc94bc4759b75116adfe773f496',1,'operator!=(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51077c5df4c6a888b84142e1af07b23',1,'operator!=(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb9347618d1909b4307d5f5e8d5e0ec1',1,'operator!=(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70e9295c70897f7ee8f165b2b9b92006',1,'operator!=(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7816e638f08658a7127889f8924d463a',1,'operator!=(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec66007c1a31dcf3aa21addda8d2e057',1,'operator!=(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5df23018756bf58482b48b72f91c69',1,'operator!=(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9f59dd31ae3f09e713717a052fb2d41',1,'operator!=(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2edb4f9db0181f0ed159c100272de19e',1,'operator!=(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14cc69402191ad1a9fadafc1797e4e5',1,'operator!=(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefc9c61d220f8a87a7c07e07a1de92ef',1,'operator!=(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c1259a165b16ae5e1a2e7582dc6ca19',1,'operator!=(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27400033a8ccdaf73828d9569ab1d11f',1,'operator!=(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64ebcee14a400f7d929e78336d556f76',1,'operator!=(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c2fc1b7beb65f98f4f60313e89892',1,'operator!=(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd4ea537ef260913359d331676ee41',1,'operator!=(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d16922ec836552a427512b69378cea5',1,'operator!=(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23335c5da9c49fc7fad795f8151ed17e',1,'operator!=(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e6ecff1ed67f5619c81d15d6c61d2aa',1,'operator!=(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d04608dbf78c558bbc9fe3157c1fa03',1,'operator!=(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2b7ac6b676b027054f92659fcbd62b3',1,'operator!=(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1074c3499e6d2197ec635fb11e013f59',1,'operator!=(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ab051cea08cf039852e3351b93b8c5a81',1,'__gnu_cxx::operator!=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a1181402b4656a1da4bf2e9608aed3c38',1,'__gnu_cxx::operator!=(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a9deee1071e354ea98296b431b4643511',1,'__gnu_cxx::operator!=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga51a6d053b3eb004ee172b8e7ef066854',1,'std::operator!=(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a481ee02f06a7c42bd2762516975d7082',1,'std::operator!=(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a98c391c7d64a5a01cf0d162c4fb959ca',1,'std::operator!=(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#gafb9c9578afd0299fc357581cb848f2fd',1,'std::operator!=(const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__lhs, const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga226dae1d9406b9c3804f20d31c15e21a',1,'std::operator!=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga08598cac266ed03507603ca6d6c27ce2',1,'std::operator!=(const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__lhs, const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a48d985ba8cc72e159372b14b9114da73',1,'std::operator!=(const function< _Res(_Args...)> &__f, nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac0daaa77f5550fd185352175aa05fc89',1,'std::operator!=(nullptr_t, const function< _Res(_Args...)> &__f) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga58cddddd716e5fe8d9ef54732399b68f',1,'std::operator!=(const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__lhs, const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a20729b0ed4cf42aa7dba9c24e71243f0',1,'std::operator!=(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2855896e6ac169748344ed4e2f064ccb',1,'std::operator!=(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e9b319feda06c3f9bbc8c501d7ed5c',1,'std::operator!=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga223f7056b37b325f9d70eda843982dff',1,'std::operator!=(const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__lhs, const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga26b97c6b57337790d75c65c39461d57b',1,'std::operator!=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a376c99e0db4e24c69c2beecd6c11b54e',1,'std::operator!=(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c4c0391a3cd864c981a2752bbb39e87',1,'std::operator!=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c5fbbe825fb3b00793f87d5b0f84b37',1,'std::operator!=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga8ad332f998832aa3bbf426abf441c34a',1,'std::operator!=(const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__lhs, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeffd353ea0720cf2338ac2cd23511b9f',1,'std::operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafd4ac060b48dc528864dcb79b7ac47b9',1,'std::operator!=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae4e62dff9be77e98ba29da34c0eee1b7',1,'std::operator!=(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6b5d199f9e89bfca5738b76671a4118b',1,'std::operator!=(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4a40078467f136b65820875414060d72',1,'std::operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga47c5a5d9835e00a60a76f4be7ea0f671',1,'std::operator!=(const std::shuffle_order_engine< _RandomNumberEngine, __k > &__lhs, const std::shuffle_order_engine< _RandomNumberEngine, __k > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gaca2a091ac2ef5b09deba9d1d185b16ad',1,'std::operator!=(const std::uniform_int_distribution< _IntType > &__d1, const std::uniform_int_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa8e4871fc2d47ad1f14e43949b9ce938',1,'std::operator!=(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gae4180334ebfbfbbae6f1f9901819a52e',1,'std::operator!=(const std::uniform_real_distribution< _IntType > &__d1, const std::uniform_real_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gade5eaebb40897ed5c453b3d1ef9ee18d',1,'std::operator!=(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a44ba4a39615cc57e58325da2c9a2372c',1,'std::operator!=(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga227eec7c437a7d893172e4387a0fb041',1,'std::operator!=(const std::normal_distribution< _RealType > &__d1, const std::normal_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a01fe16a0529fecdacda453c5cb1ce28a',1,'std::operator!=(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga611caefadf0614ec3e3a5bd8a95c11ac',1,'std::operator!=(const std::lognormal_distribution< _RealType > &__d1, const std::lognormal_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gafdf8a737eaa64e171fd0617603e7a6a7',1,'std::operator!=(const std::gamma_distribution< _RealType > &__d1, const std::gamma_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gac4dbdb98454ba9eac4efedb236380fff',1,'std::operator!=(const std::chi_squared_distribution< _RealType > &__d1, const std::chi_squared_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gaf8d44ddbae75bc9aac07aca501130b3a',1,'std::operator!=(const std::cauchy_distribution< _RealType > &__d1, const std::cauchy_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabeee8cc21eaf2d1ac14d819e56e933ee',1,'std::operator!=(const std::fisher_f_distribution< _RealType > &__d1, const std::fisher_f_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga9f65157c0c5e6316e415b7fbf5edbad4',1,'std::operator!=(const std::student_t_distribution< _RealType > &__d1, const std::student_t_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga1b42c0c69b003733630addb17455e78c',1,'std::operator!=(const std::bernoulli_distribution &__d1, const std::bernoulli_distribution &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga03255c2d29292408f9e417d8c19749d5',1,'std::operator!=(const std::binomial_distribution< _IntType > &__d1, const std::binomial_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#gada2797560998107294e60ece46615d73',1,'std::operator!=(const std::geometric_distribution< _IntType > &__d1, const std::geometric_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga0ecd009cd763508bbac68e62a14fa73c',1,'std::operator!=(const std::negative_binomial_distribution< _IntType > &__d1, const std::negative_binomial_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga16e064b3a8822c1a5b84e0b146b2a701',1,'std::operator!=(const std::poisson_distribution< _IntType > &__d1, const std::poisson_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gadb6734dde139796b0c17ab7da2092000',1,'std::operator!=(const std::exponential_distribution< _RealType > &__d1, const std::exponential_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga93a5f8cbd4387728796f825a8004f3fe',1,'std::operator!=(const std::weibull_distribution< _RealType > &__d1, const std::weibull_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga7cb0e95ae2658e8fbce52e9b83969955',1,'std::operator!=(const std::extreme_value_distribution< _RealType > &__d1, const std::extreme_value_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gaf7323b91cdc741135f4099930580987b',1,'std::operator!=(const std::discrete_distribution< _IntType > &__d1, const std::discrete_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga1c4c402db457c46e730ba427efda1f5a',1,'std::operator!=(const std::piecewise_constant_distribution< _RealType > &__d1, const std::piecewise_constant_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga34f4ca07d82381cbfd41b4563b5f265e',1,'std::operator!=(const std::piecewise_linear_distribution< _RealType > &__d1, const std::piecewise_linear_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9551f72d5a20e1b3db6d73876b71be9c',1,'std::operator!=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad109463a06be6ce8e32bd270cc92e7c8',1,'std::operator!=(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5cc85385236f8a6157f148fcf2505196',1,'std::operator!=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga73a0309c22f804987d01e41c3af8d953',1,'std::operator!=(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga4f04509aa5b848bb961d6c4898fc8ee6',1,'std::operator!=(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga05e38fe09ca2ceb867e8cbaf0df2d43b',1,'std::operator!=(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#a90a8bcb2378458899b902c6eb8834bd2',1,'std::rel_ops::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga2b4bf8c35aa9cd820d1bc042accb8687',1,'std::tr2::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga1b42c0c69b003733630addb17455e78c',1,'operator!=(const std::bernoulli_distribution &__d1, const std::bernoulli_distribution &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga03255c2d29292408f9e417d8c19749d5',1,'operator!=(const std::binomial_distribution< _IntType > &__d1, const std::binomial_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#gada2797560998107294e60ece46615d73',1,'operator!=(const std::geometric_distribution< _IntType > &__d1, const std::geometric_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga0ecd009cd763508bbac68e62a14fa73c',1,'operator!=(const std::negative_binomial_distribution< _IntType > &__d1, const std::negative_binomial_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga73a0309c22f804987d01e41c3af8d953',1,'operator!=(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga4f04509aa5b848bb961d6c4898fc8ee6',1,'operator!=(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga05e38fe09ca2ceb867e8cbaf0df2d43b',1,'operator!=(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga2b4bf8c35aa9cd820d1bc042accb8687',1,'operator!=(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga51a6d053b3eb004ee172b8e7ef066854',1,'operator!=(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga227eec7c437a7d893172e4387a0fb041',1,'operator!=(const std::normal_distribution< _RealType > &__d1, const std::normal_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga611caefadf0614ec3e3a5bd8a95c11ac',1,'operator!=(const std::lognormal_distribution< _RealType > &__d1, const std::lognormal_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gafdf8a737eaa64e171fd0617603e7a6a7',1,'operator!=(const std::gamma_distribution< _RealType > &__d1, const std::gamma_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gac4dbdb98454ba9eac4efedb236380fff',1,'operator!=(const std::chi_squared_distribution< _RealType > &__d1, const std::chi_squared_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gaf8d44ddbae75bc9aac07aca501130b3a',1,'operator!=(const std::cauchy_distribution< _RealType > &__d1, const std::cauchy_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabeee8cc21eaf2d1ac14d819e56e933ee',1,'operator!=(const std::fisher_f_distribution< _RealType > &__d1, const std::fisher_f_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga9f65157c0c5e6316e415b7fbf5edbad4',1,'operator!=(const std::student_t_distribution< _RealType > &__d1, const std::student_t_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga16e064b3a8822c1a5b84e0b146b2a701',1,'operator!=(const std::poisson_distribution< _IntType > &__d1, const std::poisson_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gadb6734dde139796b0c17ab7da2092000',1,'operator!=(const std::exponential_distribution< _RealType > &__d1, const std::exponential_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga93a5f8cbd4387728796f825a8004f3fe',1,'operator!=(const std::weibull_distribution< _RealType > &__d1, const std::weibull_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga7cb0e95ae2658e8fbce52e9b83969955',1,'operator!=(const std::extreme_value_distribution< _RealType > &__d1, const std::extreme_value_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gaf7323b91cdc741135f4099930580987b',1,'operator!=(const std::discrete_distribution< _IntType > &__d1, const std::discrete_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga1c4c402db457c46e730ba427efda1f5a',1,'operator!=(const std::piecewise_constant_distribution< _RealType > &__d1, const std::piecewise_constant_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga34f4ca07d82381cbfd41b4563b5f265e',1,'operator!=(const std::piecewise_linear_distribution< _RealType > &__d1, const std::piecewise_linear_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#gafb9c9578afd0299fc357581cb848f2fd',1,'operator!=(const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__lhs, const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga08598cac266ed03507603ca6d6c27ce2',1,'operator!=(const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__lhs, const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga58cddddd716e5fe8d9ef54732399b68f',1,'operator!=(const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__lhs, const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga223f7056b37b325f9d70eda843982dff',1,'operator!=(const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__lhs, const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga8ad332f998832aa3bbf426abf441c34a',1,'operator!=(const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__lhs, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga47c5a5d9835e00a60a76f4be7ea0f671',1,'operator!=(const std::shuffle_order_engine< _RandomNumberEngine, __k > &__lhs, const std::shuffle_order_engine< _RandomNumberEngine, __k > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e9b319feda06c3f9bbc8c501d7ed5c',1,'operator!=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga26b97c6b57337790d75c65c39461d57b',1,'operator!=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c4c0391a3cd864c981a2752bbb39e87',1,'operator!=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c5fbbe825fb3b00793f87d5b0f84b37',1,'operator!=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeffd353ea0720cf2338ac2cd23511b9f',1,'operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafd4ac060b48dc528864dcb79b7ac47b9',1,'operator!=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4a40078467f136b65820875414060d72',1,'operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gade5eaebb40897ed5c453b3d1ef9ee18d',1,'operator!=(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gaca2a091ac2ef5b09deba9d1d185b16ad',1,'operator!=(const std::uniform_int_distribution< _IntType > &__d1, const std::uniform_int_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gae4180334ebfbfbbae6f1f9901819a52e',1,'operator!=(const std::uniform_real_distribution< _IntType > &__d1, const std::uniform_real_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga226dae1d9406b9c3804f20d31c15e21a',1,'operator!=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], - ['operator_25_318',['operator%',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6ec4cce27f5f5c22c51fd8923d0f11',1,'cv::softdouble::operator%()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga69f4dbc0a0eace2d056676b41ca65ff2',1,'cv::softfloat::operator%()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa37b11432b1ebde054af826f340a2c31',1,'cv::cudev::operator%(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab31dfd9be961e597a6ff20fe16aa442b',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga773b0b2650985c05a19fc3b2cea02157',1,'cv::cudev::operator%(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e04cff3e3f4dc32f4ad6f4ea1a175f1',1,'cv::cudev::operator%(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b8b1d46430656d69ace43bf63ef5a03',1,'cv::cudev::operator%(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9aa960339addec61dae59f72ad661f6',1,'cv::cudev::operator%(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59fd9fd64abbdbf6d02111258ff3ee3a',1,'cv::cudev::operator%(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dcc4a1f5610061e0994d8554cfc765b',1,'cv::cudev::operator%(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6093692666282b857f5c312c9669def',1,'cv::cudev::operator%(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9290539128e5d0844f4480b49b3d7088',1,'cv::cudev::operator%(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9373b5425bc87bbf899c139216f9a60a',1,'cv::cudev::operator%(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82bdb4bd976961e8077c200d91a371e3',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d5639fedbfd3ea5fae538d1ccbb97f4',1,'cv::cudev::operator%(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga761216132a87e3c512b66743403bd25e',1,'cv::cudev::operator%(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4a930fbaafd0bef775d17c39a71fc97',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa27152eb3298e3345232dd01c77c0d',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57c116145cb62d4a4027f9639145aa45',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb82ed401680a151f1d811f79c907687',1,'cv::cudev::operator%(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20f538ce841c4168ea7b676bc4d721ce',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea561c006efad0fe66fb54961baf414f',1,'cv::cudev::operator%(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74bf8c1b04c651db7c598cf7064b763',1,'cv::cudev::operator%(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5314568374d8a1d07ca11c4bb88047c',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7714be790d76153dbdc8d751a943bc',1,'cv::cudev::operator%(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d4e175fcb53cd7926bc3787754faf86',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga69f4dbc0a0eace2d056676b41ca65ff2',1,'operator%(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6ec4cce27f5f5c22c51fd8923d0f11',1,'operator%(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa37b11432b1ebde054af826f340a2c31',1,'operator%(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab31dfd9be961e597a6ff20fe16aa442b',1,'operator%(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga773b0b2650985c05a19fc3b2cea02157',1,'operator%(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e04cff3e3f4dc32f4ad6f4ea1a175f1',1,'operator%(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b8b1d46430656d69ace43bf63ef5a03',1,'operator%(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9aa960339addec61dae59f72ad661f6',1,'operator%(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59fd9fd64abbdbf6d02111258ff3ee3a',1,'operator%(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dcc4a1f5610061e0994d8554cfc765b',1,'operator%(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6093692666282b857f5c312c9669def',1,'operator%(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9290539128e5d0844f4480b49b3d7088',1,'operator%(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9373b5425bc87bbf899c139216f9a60a',1,'operator%(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82bdb4bd976961e8077c200d91a371e3',1,'operator%(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d5639fedbfd3ea5fae538d1ccbb97f4',1,'operator%(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga761216132a87e3c512b66743403bd25e',1,'operator%(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4a930fbaafd0bef775d17c39a71fc97',1,'operator%(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa27152eb3298e3345232dd01c77c0d',1,'operator%(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57c116145cb62d4a4027f9639145aa45',1,'operator%(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb82ed401680a151f1d811f79c907687',1,'operator%(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20f538ce841c4168ea7b676bc4d721ce',1,'operator%(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea561c006efad0fe66fb54961baf414f',1,'operator%(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74bf8c1b04c651db7c598cf7064b763',1,'operator%(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5314568374d8a1d07ca11c4bb88047c',1,'operator%(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7714be790d76153dbdc8d751a943bc',1,'operator%(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d4e175fcb53cd7926bc3787754faf86',1,'operator%(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)']]], - ['operator_25_3d_319',['operator%=',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae22a90109adc61a7fba881c7f495002f',1,'cv::softdouble::operator%=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4bd168a6fe89d0016b05917d2c067e00',1,'cv::softfloat::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga707e141e760766ca9cbdb6be26941cd4',1,'std::gslice_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaec955c90f1d087dd1a6a2bd41a5cea7a',1,'std::indirect_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa321a7c18f23aae720cdd059ea38fcc2',1,'std::mask_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga51b2370973ce4cfa93b21428c23e3da0',1,'std::slice_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga64fd546424cb6eb21396e7049fb2c17e',1,'std::valarray::operator%=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc5edf2598de6c9bbfe67c8cdc7ff3ab',1,'std::valarray::operator%=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga64fd546424cb6eb21396e7049fb2c17e',1,'valarray< size_t >::operator%=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc5edf2598de6c9bbfe67c8cdc7ff3ab',1,'valarray< size_t >::operator%=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4bd168a6fe89d0016b05917d2c067e00',1,'operator%=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae22a90109adc61a7fba881c7f495002f',1,'operator%=(const softdouble &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga707e141e760766ca9cbdb6be26941cd4',1,'operator%=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga64fd546424cb6eb21396e7049fb2c17e',1,'operator%=(const _Tp &)(Global Namespace)']]], - ['operator_26_320',['operator&',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad5ca0810ca85918075da95a79d9a97f7',1,'cv::MatExpr::operator&(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac2374f3eaff03e88ed89e166a68d2ae0',1,'cv::MatExpr::operator&(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2a9d86f1b3e1c8840fbcdaedc357c3dc',1,'cv::MatExpr::operator&(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abdc64797e9de5a15144a9c6faff33638',1,'cv::MatExpr::operator&(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab86886f75e72d222c79be0eef13e54ad',1,'cv::MatExpr::operator&(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad5ca0810ca85918075da95a79d9a97f7',1,'cv::MatExpr::operator&(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac2374f3eaff03e88ed89e166a68d2ae0',1,'cv::MatExpr::operator&(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2a9d86f1b3e1c8840fbcdaedc357c3dc',1,'cv::MatExpr::operator&(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abdc64797e9de5a15144a9c6faff33638',1,'cv::MatExpr::operator&(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab86886f75e72d222c79be0eef13e54ad',1,'cv::MatExpr::operator&(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6957bb19d507c40a6915ddd22d1249c4',1,'cv::operator&()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2824fbead5dd62215b4a3962cd3265a3',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac81e02d2c96e3a90c65ce87da156d271',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga144767d1bb4daf6ea0fda36e2e20d4ca',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322dc9a03abc6081db6a879167ebd0c4',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c02de846f3e7774b67e6cb212f91649',1,'cv::cudev::operator&(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691cca0881f07410c194b6b1026a77fb',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e44f3fd51a9f96cc64728aa9c30b0e',1,'cv::cudev::operator&(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd9a0060a95f7eaa54e4de45114028ba',1,'cv::cudev::operator&(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5998775c6f8394bae10ff602c588608',1,'cv::cudev::operator&(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f774843bd845f4bc86e06bdb6c31408',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga238c55671d39087ce44545a5ed98ab1c',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab70b9ac4715868342622dd46f9d29d6a',1,'cv::cudev::operator&(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab73b7952cc39f426b985c670ce7f5b52',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8eae30f62afa2a06307185a43725c74',1,'cv::cudev::operator&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga094b70ca656ab78b3b1f781f929f7567',1,'cv::cudev::operator&(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0913f4f62618507ffc8c0d16251044cd',1,'cv::cudev::operator&(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86dc7c80ee41020ef9ff3b62ae4a2cb6',1,'cv::cudev::operator&(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e6bf0498079e6b9f44052db5b1e89',1,'cv::cudev::operator&(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3476659b715cb17d4c7cb0e217b803d',1,'cv::cudev::operator&(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8498963f3694cb7e5559c1fa089122e',1,'cv::cudev::operator&(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1715d8f7390bd9637882e80d266d8962',1,'cv::cudev::operator&(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad955789a18991c3c601fb6d95cdde9d9',1,'cv::cudev::operator&(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6189769261ab09d9f2f88b0d95d9b69c',1,'cv::cudev::operator&(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47b903733bfaf612b130ab5feaa4e834',1,'cv::cudev::operator&(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6680357b706655b3d4f59ebf6cde1bda',1,'cv::cudev::operator&(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga410ee41519d0e468f977064eca80ca6b',1,'cv::cudev::operator&(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga933b51f3537cb5bd2ca304032f702301',1,'cv::cudev::operator&(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3d2a81a49a5b4ae71bea0e1086650e5',1,'cv::cudev::operator&(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f515f625c04355b920763fbb60934f1',1,'cv::cudev::operator&(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1433b28090a0d04a08045f8de4fecce6',1,'cv::cudev::operator&(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga142e290d05fe7b33f550490478e6bf1c',1,'cv::cudev::operator&(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3956877ec91ef9b8bfd3b4cdf9e7834',1,'cv::cudev::operator&(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d052d31f5b99e648bec17eabcf72643',1,'cv::cudev::operator&(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga447adc88942acc85e431fb7c02584d25',1,'cv::cudev::operator&(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9c66db9a9cfaea6024241e8b1a6acd',1,'cv::cudev::operator&(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d8637568a82c8c300778bd702219d74',1,'cv::cudev::operator&(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga020bb49349993c9d1b6088426f81dfce',1,'cv::cudev::operator&(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50d73894dfb821ab9e3d7aefafed6075',1,'cv::cudev::operator&(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5585ad32954a8f0720a5d88668161ff',1,'cv::cudev::operator&(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7902b60973c6adc297c83152ac0806',1,'cv::cudev::operator&(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0318ec2367da1e372fd5e28b1eab218b',1,'cv::cudev::operator&(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac701681464db5140bc0fab9835f95115',1,'cv::cudev::operator&(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17af2a172ba1fa5938a093c4f9c0eac5',1,'cv::cudev::operator&(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0b49b7d04484f831a731783656099d2',1,'cv::cudev::operator&(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75427aad0e6d9c3c2d6fa9cb246c227d',1,'cv::cudev::operator&(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64f469db78287435cc118baca7fc9a59',1,'cv::cudev::operator&(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44adf7d1bca7f3db25e94fc301c7d678',1,'cv::cudev::operator&(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69834e5b601a5b3bcd816f707b7b3b39',1,'cv::cudev::operator&(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b9761105bb7f9de7916d7d18c7b59bc',1,'cv::cudev::operator&(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab3eb409493f1177554f7cd8a1606318',1,'cv::cudev::operator&(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0eeb6595b46265a3e9bdf9132960798',1,'cv::cudev::operator&(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7977db362f2714454a13ce8be3cf7d35',1,'cv::cudev::operator&(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa25aab84c9af7fcb275c62366cda31ff',1,'cv::cudev::operator&(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd225b01b0b95ad01a57d361b5378ad9',1,'cv::cudev::operator&(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a57e28ab5789a6ab5e3763d7eae3a5e',1,'cv::cudev::operator&(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09703b8694475c3f60d87240ead7ab9c',1,'cv::cudev::operator&(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9250d1f6ecee8ad1dc4b7ca2f8119d7a',1,'cv::cudev::operator&(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga600dc4708da63b278579de8250268fda',1,'cv::cudev::operator&(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12da3f8eecbcdcbdfda3b88b0656de26',1,'cv::cudev::operator&(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72c946da7805977984f0c3e67805271f',1,'cv::cudev::operator&(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12cbff5375b5fe75cb11aa1ceec29e12',1,'cv::cudev::operator&(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e56c435219a48922c9e0bc4dbae5731',1,'cv::cudev::operator&(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f3310022e46b2058670f9d6d9299f39',1,'cv::cudev::operator&(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2d39ebbf206189dc22406a1a2fed139',1,'cv::cudev::operator&(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga068e477cd2843f7b78897fa476592131',1,'cv::cudev::operator&(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51bb0adc5368740ed76777f54a476874',1,'cv::cudev::operator&(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2978c32bb65ec46ca1d351ed7a3eae6',1,'cv::cudev::operator&(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87142039aff3429c8a5a07e52a30f857',1,'cv::cudev::operator&(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cf577b65c982883d6e83281db193dee',1,'cv::cudev::operator&(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8427d79ce048b5397fd13acfe46b0cb8',1,'cv::cudev::operator&(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c00c23cee32f10298bafb1f26393f7b',1,'cv::cudev::operator&(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68e97414257334444f9b1238164108f9',1,'cv::cudev::operator&(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ffa9ba4cd1b5284df92cb84f52d893f',1,'cv::cudev::operator&(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d94fd3ad9493292e1015a141cb3b75',1,'cv::cudev::operator&(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c39d2a806d68167e5bec9b1bef88fa5',1,'cv::cudev::operator&(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa46e182b2a2cf5fb4e36d9872ef0f643',1,'cv::cudev::operator&(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d014dc5b0c60ccbee2f4818a6b2057b',1,'cv::cudev::operator&(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2b5c40d3f569407c9a67bfc1e6b7e89',1,'cv::cudev::operator&(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga099252f9ea434dc03ebd12a8d6ad446e',1,'cv::cudev::operator&(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae242e51d22b353b9ddcff233be97be6f',1,'cv::cudev::operator&(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17e0ec430072e4254a93b539475a5aa1',1,'cv::cudev::operator&(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga883ec5e2401d4cba39d1e4a61b968d94',1,'cv::cudev::operator&(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf31f6fafe2187bc62231e4d0af623cad',1,'cv::cudev::operator&(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc1e6f9244edefd36feff70a5eb86150',1,'cv::cudev::operator&(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab69568bca24e4407e2658ac08a843681',1,'cv::cudev::operator&(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04720d9d8f413cfb21fcb97e53435911',1,'cv::cudev::operator&(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86170e2b7b037f8d980d18f876e72c8d',1,'cv::cudev::operator&(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0707c9dedfd86a692e37e96fe1661ca',1,'cv::cudev::operator&(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6cf168e908a747b46770c3c49cc239',1,'cv::cudev::operator&(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9886a421fb77d7c4b6c69fb3265e3a5b',1,'cv::cudev::operator&(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac32cf95373924bf8cecb00934eeb13ce',1,'cv::cudev::operator&(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac45d05b0b072454d8a1e434bc31a2622',1,'cv::cudev::operator&(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f62603bc29e2ad5f85228039996f9f',1,'cv::cudev::operator&(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf63f98e35a6ecd4b52e32c00aec377ce',1,'cv::cudev::operator&(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga167cfb86156279d9446b2428dfcdf459',1,'cv::cudev::operator&(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19d008f7753dd3651d38cf48c2fef06c',1,'cv::cudev::operator&(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ab76078d3f1909db7086b0360c9fc8b6d',1,'cv::gapi::own::operator&()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6957bb19d507c40a6915ddd22d1249c4',1,'operator&(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2824fbead5dd62215b4a3962cd3265a3',1,'operator&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac81e02d2c96e3a90c65ce87da156d271',1,'operator&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga144767d1bb4daf6ea0fda36e2e20d4ca',1,'operator&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322dc9a03abc6081db6a879167ebd0c4',1,'operator&(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c02de846f3e7774b67e6cb212f91649',1,'operator&(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691cca0881f07410c194b6b1026a77fb',1,'operator&(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e44f3fd51a9f96cc64728aa9c30b0e',1,'operator&(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd9a0060a95f7eaa54e4de45114028ba',1,'operator&(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5998775c6f8394bae10ff602c588608',1,'operator&(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f774843bd845f4bc86e06bdb6c31408',1,'operator&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga238c55671d39087ce44545a5ed98ab1c',1,'operator&(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab70b9ac4715868342622dd46f9d29d6a',1,'operator&(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab73b7952cc39f426b985c670ce7f5b52',1,'operator&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8eae30f62afa2a06307185a43725c74',1,'operator&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga094b70ca656ab78b3b1f781f929f7567',1,'operator&(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0913f4f62618507ffc8c0d16251044cd',1,'operator&(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86dc7c80ee41020ef9ff3b62ae4a2cb6',1,'operator&(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e6bf0498079e6b9f44052db5b1e89',1,'operator&(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3476659b715cb17d4c7cb0e217b803d',1,'operator&(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8498963f3694cb7e5559c1fa089122e',1,'operator&(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1715d8f7390bd9637882e80d266d8962',1,'operator&(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad955789a18991c3c601fb6d95cdde9d9',1,'operator&(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6189769261ab09d9f2f88b0d95d9b69c',1,'operator&(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47b903733bfaf612b130ab5feaa4e834',1,'operator&(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6680357b706655b3d4f59ebf6cde1bda',1,'operator&(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga410ee41519d0e468f977064eca80ca6b',1,'operator&(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga933b51f3537cb5bd2ca304032f702301',1,'operator&(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3d2a81a49a5b4ae71bea0e1086650e5',1,'operator&(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f515f625c04355b920763fbb60934f1',1,'operator&(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1433b28090a0d04a08045f8de4fecce6',1,'operator&(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga142e290d05fe7b33f550490478e6bf1c',1,'operator&(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3956877ec91ef9b8bfd3b4cdf9e7834',1,'operator&(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d052d31f5b99e648bec17eabcf72643',1,'operator&(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga447adc88942acc85e431fb7c02584d25',1,'operator&(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9c66db9a9cfaea6024241e8b1a6acd',1,'operator&(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d8637568a82c8c300778bd702219d74',1,'operator&(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga020bb49349993c9d1b6088426f81dfce',1,'operator&(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50d73894dfb821ab9e3d7aefafed6075',1,'operator&(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5585ad32954a8f0720a5d88668161ff',1,'operator&(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7902b60973c6adc297c83152ac0806',1,'operator&(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0318ec2367da1e372fd5e28b1eab218b',1,'operator&(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac701681464db5140bc0fab9835f95115',1,'operator&(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17af2a172ba1fa5938a093c4f9c0eac5',1,'operator&(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0b49b7d04484f831a731783656099d2',1,'operator&(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75427aad0e6d9c3c2d6fa9cb246c227d',1,'operator&(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64f469db78287435cc118baca7fc9a59',1,'operator&(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44adf7d1bca7f3db25e94fc301c7d678',1,'operator&(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69834e5b601a5b3bcd816f707b7b3b39',1,'operator&(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b9761105bb7f9de7916d7d18c7b59bc',1,'operator&(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab3eb409493f1177554f7cd8a1606318',1,'operator&(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0eeb6595b46265a3e9bdf9132960798',1,'operator&(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7977db362f2714454a13ce8be3cf7d35',1,'operator&(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa25aab84c9af7fcb275c62366cda31ff',1,'operator&(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd225b01b0b95ad01a57d361b5378ad9',1,'operator&(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a57e28ab5789a6ab5e3763d7eae3a5e',1,'operator&(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09703b8694475c3f60d87240ead7ab9c',1,'operator&(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9250d1f6ecee8ad1dc4b7ca2f8119d7a',1,'operator&(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga600dc4708da63b278579de8250268fda',1,'operator&(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12da3f8eecbcdcbdfda3b88b0656de26',1,'operator&(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72c946da7805977984f0c3e67805271f',1,'operator&(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12cbff5375b5fe75cb11aa1ceec29e12',1,'operator&(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e56c435219a48922c9e0bc4dbae5731',1,'operator&(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f3310022e46b2058670f9d6d9299f39',1,'operator&(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2d39ebbf206189dc22406a1a2fed139',1,'operator&(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga068e477cd2843f7b78897fa476592131',1,'operator&(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51bb0adc5368740ed76777f54a476874',1,'operator&(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2978c32bb65ec46ca1d351ed7a3eae6',1,'operator&(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87142039aff3429c8a5a07e52a30f857',1,'operator&(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cf577b65c982883d6e83281db193dee',1,'operator&(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8427d79ce048b5397fd13acfe46b0cb8',1,'operator&(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c00c23cee32f10298bafb1f26393f7b',1,'operator&(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68e97414257334444f9b1238164108f9',1,'operator&(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ffa9ba4cd1b5284df92cb84f52d893f',1,'operator&(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d94fd3ad9493292e1015a141cb3b75',1,'operator&(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c39d2a806d68167e5bec9b1bef88fa5',1,'operator&(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa46e182b2a2cf5fb4e36d9872ef0f643',1,'operator&(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d014dc5b0c60ccbee2f4818a6b2057b',1,'operator&(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2b5c40d3f569407c9a67bfc1e6b7e89',1,'operator&(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga099252f9ea434dc03ebd12a8d6ad446e',1,'operator&(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae242e51d22b353b9ddcff233be97be6f',1,'operator&(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17e0ec430072e4254a93b539475a5aa1',1,'operator&(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga883ec5e2401d4cba39d1e4a61b968d94',1,'operator&(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf31f6fafe2187bc62231e4d0af623cad',1,'operator&(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc1e6f9244edefd36feff70a5eb86150',1,'operator&(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab69568bca24e4407e2658ac08a843681',1,'operator&(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04720d9d8f413cfb21fcb97e53435911',1,'operator&(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86170e2b7b037f8d980d18f876e72c8d',1,'operator&(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0707c9dedfd86a692e37e96fe1661ca',1,'operator&(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6cf168e908a747b46770c3c49cc239',1,'operator&(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9886a421fb77d7c4b6c69fb3265e3a5b',1,'operator&(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac32cf95373924bf8cecb00934eeb13ce',1,'operator&(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac45d05b0b072454d8a1e434bc31a2622',1,'operator&(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f62603bc29e2ad5f85228039996f9f',1,'operator&(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf63f98e35a6ecd4b52e32c00aec377ce',1,'operator&(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga167cfb86156279d9446b2428dfcdf459',1,'operator&(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19d008f7753dd3651d38cf48c2fef06c',1,'operator&(const uint4 &a, uint s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0bad6c26bf52fd395038f073e09423b9',1,'std::operator&()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#aa181d58777df9e46fdd8b6cf08dd12c3',1,'std::regex_constants::operator&(syntax_option_type __a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a91f43c51d82f4484019c321d420a9fa3',1,'std::regex_constants::operator&(match_flag_type __a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gacc832712a19ae288e2b01ba85bee3d5a',1,'std::tr2::operator&()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gacc832712a19ae288e2b01ba85bee3d5a',1,'operator&()(Global Namespace)']]], - ['operator_26_26_321',['operator&&',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9daa85a8c304bfe871adc47da30a4075',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c3601d795120192cba3966eae171f10',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3bdc6d15e263a0dabfd93f5c2e4b65f',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad06b1219c0854f5f7bb80f38df9d8cb4',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga897646556f5a3a133b41494b371b484b',1,'cv::cudev::operator&&(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa883a73a52c65d1e648c2f8844352ceb',1,'cv::cudev::operator&&(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468fd922ef425cca9d9ec40fc702cc52',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2816ac7d00137b8a6631c13355bbf84d',1,'cv::cudev::operator&&(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3a1b877260a04e1c1664908d89f87c1',1,'cv::cudev::operator&&(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51ac89a7446501931038d95fca430398',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987ac6dfee9f13d1365e8741da3ea37a',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace124f27b31537a2901a0dfa2c5a52ba',1,'cv::cudev::operator&&(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508b443e9fd9a0b93d9ae46f85a64edb',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2048cae02db953f223509133d6c274da',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6e25ae76fb3499ae0e9655b6fa6c5d4',1,'cv::cudev::operator&&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc7b300e441c12d3f877fbba0f640f91',1,'cv::cudev::operator&&(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6df462ce5ffc9b3ee0fe42b1fc3bfb0f',1,'cv::cudev::operator&&(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfa8ff8614d4e00b93ee2d759819a4cb',1,'cv::cudev::operator&&(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dd173482aba8974fc0592b0c25f3c2',1,'cv::cudev::operator&&(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac76e6288a150f76f61a2824840344e7b',1,'cv::cudev::operator&&(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9be5fb383bfaf67c9bc2af53e6ae445',1,'cv::cudev::operator&&(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cee20c36d3655a18dae9c643a08db82',1,'cv::cudev::operator&&(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65a91568d8a8069dbd33c5f48ef8e691',1,'cv::cudev::operator&&(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac51b458c5da2918473fee75cb6e10955',1,'cv::cudev::operator&&(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56cf2aa63abdf862d31098458753edbb',1,'cv::cudev::operator&&(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dc1d206c05395102ddc5a1a287461e',1,'cv::cudev::operator&&(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990451138951363139dd592adce0ff78',1,'cv::cudev::operator&&(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae22e605f6aff9ef0a408e0caa81925ec',1,'cv::cudev::operator&&(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc48e8ac73e455ef8bd4b6f830280f09',1,'cv::cudev::operator&&(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a58600dc51ddd5a9609e2ebd5e2fbca',1,'cv::cudev::operator&&(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e50d6f24de8bf739a28d4f25dcc791b',1,'cv::cudev::operator&&(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa394cdb2ec6fa3211a4a76c8dd2d849e',1,'cv::cudev::operator&&(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7c5a779467e224a84de95a4cf906ae4',1,'cv::cudev::operator&&(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9a6d566256f6915d183f3a8ac8b85ba',1,'cv::cudev::operator&&(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff4f4526f76a68ac06eadc1b0a6be0c',1,'cv::cudev::operator&&(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a9ddd3b6a9e3f208a416bed9990c4e',1,'cv::cudev::operator&&(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755ae4826d5870d832393255b0922921',1,'cv::cudev::operator&&(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ba3e08f2b0c31afc32421751f1f80d',1,'cv::cudev::operator&&(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f917aa69f90085189ec9e06612bfa07',1,'cv::cudev::operator&&(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7916e11ea81ef8251fe45d086c96be20',1,'cv::cudev::operator&&(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b05c87a1d20f8b880ab6cbda2db9bd3',1,'cv::cudev::operator&&(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d8edae6372de657170a6d8503e50546',1,'cv::cudev::operator&&(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga597ef8e3f532caf8cf102750203625dc',1,'cv::cudev::operator&&(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dab250b0b130cd0128d02fec06b4842',1,'cv::cudev::operator&&(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c9e483c92927b8a6ebede43d4413a1',1,'cv::cudev::operator&&(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76c52d8fb9195ffbc8e724038305864f',1,'cv::cudev::operator&&(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf943568be0acae96b5b025b73efec7fb',1,'cv::cudev::operator&&(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5eba7700c8b81b388425b3d0b138c6f',1,'cv::cudev::operator&&(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac16ec172d052e95bbf324345dac02567',1,'cv::cudev::operator&&(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0885c4984c4251641df3bc3f2720ac90',1,'cv::cudev::operator&&(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a132cd81a7e17cdb05f15ed4d04c810',1,'cv::cudev::operator&&(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga784e168129bc4fce6b3f7c17ed5fc70d',1,'cv::cudev::operator&&(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdfe6638006d040dd4c446f2e0a2394',1,'cv::cudev::operator&&(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6376582bf0339f0b9c9388fadc8d8ca4',1,'cv::cudev::operator&&(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafce02da16b670515cf35ac56ef70f550',1,'cv::cudev::operator&&(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga173fe35e9054cb5a39aa6e8880866cda',1,'cv::cudev::operator&&(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e115f94ba7670c47892d29058840e15',1,'cv::cudev::operator&&(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e28550c974cc909cb44d798988cce12',1,'cv::cudev::operator&&(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cc212c7d51a10bcbd8b7f0156160fe3',1,'cv::cudev::operator&&(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec57a07d4d17363ae5e7e387fcea30a0',1,'cv::cudev::operator&&(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f3a4fb3fa1532375e8890053394ab03',1,'cv::cudev::operator&&(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3986bd1d079a19f0f4ec3255a74c748',1,'cv::cudev::operator&&(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f3bd5cbe1e0bf123190c0a600eed871',1,'cv::cudev::operator&&(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9456d12d1542746d8289926ca17494c2',1,'cv::cudev::operator&&(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a553dd9208cba98dba26d25074ea3fc',1,'cv::cudev::operator&&(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9752fe7958a740cea43e4f5bd4f1a15',1,'cv::cudev::operator&&(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaece716a600686f5b9781ec870ea442f0',1,'cv::cudev::operator&&(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4573fd86b5ee0040383fd285235a066d',1,'cv::cudev::operator&&(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75403ae82171c1a3eae6dbeefb12dc02',1,'cv::cudev::operator&&(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31c1bf92bb175a9fa8596c438db86014',1,'cv::cudev::operator&&(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74734139f4f10325d11fe6a9085279e1',1,'cv::cudev::operator&&(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25395032ad06d8e8c445079cb8e9aa42',1,'cv::cudev::operator&&(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6a649ac42b67feb71003beddbacd7f0',1,'cv::cudev::operator&&(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31766171823163be81c9b812569822e6',1,'cv::cudev::operator&&(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2a9aee1a3645f4251ce647c2927d452',1,'cv::cudev::operator&&(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada168ab6107bd0ccfd2bd501f3e277f3',1,'cv::cudev::operator&&(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b4509b995583bc214680c6327af30e0',1,'cv::cudev::operator&&(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8006f3728e9e0df5a7f72765d207b406',1,'cv::cudev::operator&&(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30b7bb6d73291c7482998899eb14d144',1,'cv::cudev::operator&&(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ddc4cbc632339a238fb6d9ed1b9a5ca',1,'cv::cudev::operator&&(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59c31536e15ee1bfcc9e0a2a2babbb44',1,'cv::cudev::operator&&(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4122355804f4d7068d2c3e727f060c69',1,'cv::cudev::operator&&(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56ceb64916924c2b210aeeeea43cb93',1,'cv::cudev::operator&&(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee9ad5547e1a27092cd79622c56ac2b7',1,'cv::cudev::operator&&(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a48ccd60d6b596798654adec10cbda0',1,'cv::cudev::operator&&(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9f44a6c26c30d6a39bc45a623dc6a3',1,'cv::cudev::operator&&(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cb948715ea292618e5672820cebed45',1,'cv::cudev::operator&&(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae559d6cf14a6c96295a07c18a2321b33',1,'cv::cudev::operator&&(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8344d3ce2cc4c18da8df795fad1b52dc',1,'cv::cudev::operator&&(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6253898eb552c062075101942a691a7d',1,'cv::cudev::operator&&(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea4896818580da7de435628d403ce426',1,'cv::cudev::operator&&(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31e5d68382677b0c792f7fa1e545dff8',1,'cv::cudev::operator&&(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18c7b7f2c8ebb8b829ae0bd902548e58',1,'cv::cudev::operator&&(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga944653cf7179a84fc232c65418c805f7',1,'cv::cudev::operator&&(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d7df31c53c8e4dc9e0cadc7af19c732',1,'cv::cudev::operator&&(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0651016efcb1cdcac924fb59ac451c7e',1,'cv::cudev::operator&&(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c62e689f10955a1f4befb6fee373e8',1,'cv::cudev::operator&&(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d63e056e39e0fb89da997f16611a635',1,'cv::cudev::operator&&(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6744338561d677971b9c536a5065ed37',1,'cv::cudev::operator&&(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee44cddc9a95fb7d5fd14c3a904ac916',1,'cv::cudev::operator&&(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9a63465a3fce79c26a75e054f67b0c8',1,'cv::cudev::operator&&(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1418091ec7fc32cf9df83c3b33157652',1,'cv::cudev::operator&&(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f8e32c315622cd29f644906a8fb699c',1,'cv::cudev::operator&&(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b14278109d0129e03a1c122f34a400b',1,'cv::cudev::operator&&(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad24b233b709002378ddab84ebab7b8c1',1,'cv::cudev::operator&&(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7881e75bb7e5519030f9c27966e4bbc9',1,'cv::cudev::operator&&(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab59a4f1aaebaeb0ab30d236cd90ea438',1,'cv::cudev::operator&&(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16e626f8b9952b0a82fd931686d9e98a',1,'cv::cudev::operator&&(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad6bb786a45b9412453e93239972519',1,'cv::cudev::operator&&(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga918585aac4816c3ce968d179cfcfb6c9',1,'cv::cudev::operator&&(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08df2d9887291e206d3f0f42a313a220',1,'cv::cudev::operator&&(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga543d7d06fea6a02e66ecef2710cb7608',1,'cv::cudev::operator&&(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84ee73980b0845219731857a6ea350c1',1,'cv::cudev::operator&&(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ffc399abd2fb9fc96bb9700e5d5ebd',1,'cv::cudev::operator&&(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6287e06b541f138ea8c3ff9744299b2a',1,'cv::cudev::operator&&(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad006a6b3d0f83b95d337925f808bb9a0',1,'cv::cudev::operator&&(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5b87c6df19abe0807b867a8055d7210',1,'cv::cudev::operator&&(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9bf69d4894e48fe280fb7af235ee729',1,'cv::cudev::operator&&(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48663d644513466290e6c1b1467bafdb',1,'cv::cudev::operator&&(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60d7bf69aabe9bbe43a43ebc656471bd',1,'cv::cudev::operator&&(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9daa85a8c304bfe871adc47da30a4075',1,'operator&&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c3601d795120192cba3966eae171f10',1,'operator&&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3bdc6d15e263a0dabfd93f5c2e4b65f',1,'operator&&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad06b1219c0854f5f7bb80f38df9d8cb4',1,'operator&&(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga897646556f5a3a133b41494b371b484b',1,'operator&&(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa883a73a52c65d1e648c2f8844352ceb',1,'operator&&(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468fd922ef425cca9d9ec40fc702cc52',1,'operator&&(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2816ac7d00137b8a6631c13355bbf84d',1,'operator&&(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3a1b877260a04e1c1664908d89f87c1',1,'operator&&(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51ac89a7446501931038d95fca430398',1,'operator&&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987ac6dfee9f13d1365e8741da3ea37a',1,'operator&&(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace124f27b31537a2901a0dfa2c5a52ba',1,'operator&&(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508b443e9fd9a0b93d9ae46f85a64edb',1,'operator&&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2048cae02db953f223509133d6c274da',1,'operator&&(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6e25ae76fb3499ae0e9655b6fa6c5d4',1,'operator&&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc7b300e441c12d3f877fbba0f640f91',1,'operator&&(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6df462ce5ffc9b3ee0fe42b1fc3bfb0f',1,'operator&&(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfa8ff8614d4e00b93ee2d759819a4cb',1,'operator&&(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dd173482aba8974fc0592b0c25f3c2',1,'operator&&(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac76e6288a150f76f61a2824840344e7b',1,'operator&&(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9be5fb383bfaf67c9bc2af53e6ae445',1,'operator&&(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cee20c36d3655a18dae9c643a08db82',1,'operator&&(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65a91568d8a8069dbd33c5f48ef8e691',1,'operator&&(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac51b458c5da2918473fee75cb6e10955',1,'operator&&(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56cf2aa63abdf862d31098458753edbb',1,'operator&&(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dc1d206c05395102ddc5a1a287461e',1,'operator&&(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990451138951363139dd592adce0ff78',1,'operator&&(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae22e605f6aff9ef0a408e0caa81925ec',1,'operator&&(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc48e8ac73e455ef8bd4b6f830280f09',1,'operator&&(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a58600dc51ddd5a9609e2ebd5e2fbca',1,'operator&&(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e50d6f24de8bf739a28d4f25dcc791b',1,'operator&&(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa394cdb2ec6fa3211a4a76c8dd2d849e',1,'operator&&(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7c5a779467e224a84de95a4cf906ae4',1,'operator&&(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9a6d566256f6915d183f3a8ac8b85ba',1,'operator&&(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff4f4526f76a68ac06eadc1b0a6be0c',1,'operator&&(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a9ddd3b6a9e3f208a416bed9990c4e',1,'operator&&(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755ae4826d5870d832393255b0922921',1,'operator&&(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ba3e08f2b0c31afc32421751f1f80d',1,'operator&&(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f917aa69f90085189ec9e06612bfa07',1,'operator&&(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7916e11ea81ef8251fe45d086c96be20',1,'operator&&(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b05c87a1d20f8b880ab6cbda2db9bd3',1,'operator&&(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d8edae6372de657170a6d8503e50546',1,'operator&&(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga597ef8e3f532caf8cf102750203625dc',1,'operator&&(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dab250b0b130cd0128d02fec06b4842',1,'operator&&(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c9e483c92927b8a6ebede43d4413a1',1,'operator&&(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76c52d8fb9195ffbc8e724038305864f',1,'operator&&(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf943568be0acae96b5b025b73efec7fb',1,'operator&&(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5eba7700c8b81b388425b3d0b138c6f',1,'operator&&(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac16ec172d052e95bbf324345dac02567',1,'operator&&(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0885c4984c4251641df3bc3f2720ac90',1,'operator&&(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a132cd81a7e17cdb05f15ed4d04c810',1,'operator&&(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga784e168129bc4fce6b3f7c17ed5fc70d',1,'operator&&(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdfe6638006d040dd4c446f2e0a2394',1,'operator&&(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6376582bf0339f0b9c9388fadc8d8ca4',1,'operator&&(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafce02da16b670515cf35ac56ef70f550',1,'operator&&(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga173fe35e9054cb5a39aa6e8880866cda',1,'operator&&(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e115f94ba7670c47892d29058840e15',1,'operator&&(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e28550c974cc909cb44d798988cce12',1,'operator&&(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cc212c7d51a10bcbd8b7f0156160fe3',1,'operator&&(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec57a07d4d17363ae5e7e387fcea30a0',1,'operator&&(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f3a4fb3fa1532375e8890053394ab03',1,'operator&&(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3986bd1d079a19f0f4ec3255a74c748',1,'operator&&(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f3bd5cbe1e0bf123190c0a600eed871',1,'operator&&(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9456d12d1542746d8289926ca17494c2',1,'operator&&(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a553dd9208cba98dba26d25074ea3fc',1,'operator&&(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9752fe7958a740cea43e4f5bd4f1a15',1,'operator&&(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaece716a600686f5b9781ec870ea442f0',1,'operator&&(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4573fd86b5ee0040383fd285235a066d',1,'operator&&(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75403ae82171c1a3eae6dbeefb12dc02',1,'operator&&(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31c1bf92bb175a9fa8596c438db86014',1,'operator&&(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74734139f4f10325d11fe6a9085279e1',1,'operator&&(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25395032ad06d8e8c445079cb8e9aa42',1,'operator&&(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6a649ac42b67feb71003beddbacd7f0',1,'operator&&(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31766171823163be81c9b812569822e6',1,'operator&&(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2a9aee1a3645f4251ce647c2927d452',1,'operator&&(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada168ab6107bd0ccfd2bd501f3e277f3',1,'operator&&(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b4509b995583bc214680c6327af30e0',1,'operator&&(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8006f3728e9e0df5a7f72765d207b406',1,'operator&&(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30b7bb6d73291c7482998899eb14d144',1,'operator&&(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ddc4cbc632339a238fb6d9ed1b9a5ca',1,'operator&&(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59c31536e15ee1bfcc9e0a2a2babbb44',1,'operator&&(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4122355804f4d7068d2c3e727f060c69',1,'operator&&(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56ceb64916924c2b210aeeeea43cb93',1,'operator&&(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee9ad5547e1a27092cd79622c56ac2b7',1,'operator&&(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a48ccd60d6b596798654adec10cbda0',1,'operator&&(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9f44a6c26c30d6a39bc45a623dc6a3',1,'operator&&(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cb948715ea292618e5672820cebed45',1,'operator&&(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae559d6cf14a6c96295a07c18a2321b33',1,'operator&&(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8344d3ce2cc4c18da8df795fad1b52dc',1,'operator&&(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6253898eb552c062075101942a691a7d',1,'operator&&(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea4896818580da7de435628d403ce426',1,'operator&&(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31e5d68382677b0c792f7fa1e545dff8',1,'operator&&(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18c7b7f2c8ebb8b829ae0bd902548e58',1,'operator&&(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga944653cf7179a84fc232c65418c805f7',1,'operator&&(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d7df31c53c8e4dc9e0cadc7af19c732',1,'operator&&(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0651016efcb1cdcac924fb59ac451c7e',1,'operator&&(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c62e689f10955a1f4befb6fee373e8',1,'operator&&(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d63e056e39e0fb89da997f16611a635',1,'operator&&(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6744338561d677971b9c536a5065ed37',1,'operator&&(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee44cddc9a95fb7d5fd14c3a904ac916',1,'operator&&(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9a63465a3fce79c26a75e054f67b0c8',1,'operator&&(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1418091ec7fc32cf9df83c3b33157652',1,'operator&&(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f8e32c315622cd29f644906a8fb699c',1,'operator&&(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b14278109d0129e03a1c122f34a400b',1,'operator&&(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad24b233b709002378ddab84ebab7b8c1',1,'operator&&(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7881e75bb7e5519030f9c27966e4bbc9',1,'operator&&(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab59a4f1aaebaeb0ab30d236cd90ea438',1,'operator&&(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16e626f8b9952b0a82fd931686d9e98a',1,'operator&&(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad6bb786a45b9412453e93239972519',1,'operator&&(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga918585aac4816c3ce968d179cfcfb6c9',1,'operator&&(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08df2d9887291e206d3f0f42a313a220',1,'operator&&(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga543d7d06fea6a02e66ecef2710cb7608',1,'operator&&(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84ee73980b0845219731857a6ea350c1',1,'operator&&(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ffc399abd2fb9fc96bb9700e5d5ebd',1,'operator&&(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6287e06b541f138ea8c3ff9744299b2a',1,'operator&&(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad006a6b3d0f83b95d337925f808bb9a0',1,'operator&&(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5b87c6df19abe0807b867a8055d7210',1,'operator&&(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9bf69d4894e48fe280fb7af235ee729',1,'operator&&(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48663d644513466290e6c1b1467bafdb',1,'operator&&(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60d7bf69aabe9bbe43a43ebc656471bd',1,'operator&&(double s, const double2 &b)(Global Namespace)']]], - ['operator_26_3d_322',['operator&=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aaeeeb77b0bef34eb4eacb3905e09a561',1,'std::bitset::operator&=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aaeeeb77b0bef34eb4eacb3905e09a561',1,'std::bitset::operator&=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaca009c69acad92ea0f2244082487b32b',1,'std::gslice_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9a195965bc454b815b4035618de3f5ba',1,'std::indirect_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga243e78b1748d74ed3d4be27c8839fb87',1,'std::mask_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc4123a878dbaee0b0e8dea7aeb7216c',1,'std::slice_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae775a70aa50343f7e0d12bec75dcdd2b',1,'std::tr2::dynamic_bitset::operator&=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab623bb2bba98884ae7c3eccd227d5459',1,'std::tr2::dynamic_bitset::operator&=(dynamic_bitset &&__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae775a70aa50343f7e0d12bec75dcdd2b',1,'std::tr2::dynamic_bitset::operator&=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab623bb2bba98884ae7c3eccd227d5459',1,'std::tr2::dynamic_bitset::operator&=(dynamic_bitset &&__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6eacabfbf6099e64331966308185f957',1,'std::valarray::operator&=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafc4fe2eb569b9bca46e799f3ecb0609c',1,'std::valarray::operator&=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6eacabfbf6099e64331966308185f957',1,'valarray< size_t >::operator&=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafc4fe2eb569b9bca46e799f3ecb0609c',1,'valarray< size_t >::operator&=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1c36b9548296f20d3382808c82122ca3',1,'cv::operator&=()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#adaba058bb9999abb04506b319aff5011',1,'cv::gapi::own::operator&=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1c36b9548296f20d3382808c82122ca3',1,'operator&=()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a0ac5601f07c5581e7cc3efd6ce6a9d4f',1,'std::regex_constants::operator&=(syntax_option_type &__a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#adf8b32ecec86f9328d9e77ea918d5bd7',1,'std::regex_constants::operator&=(match_flag_type &__a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaca009c69acad92ea0f2244082487b32b',1,'operator&=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6eacabfbf6099e64331966308185f957',1,'operator&=(const _Tp &)(Global Namespace)']]], - ['operator_28_29_323',['operator()',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07999.html#a00890fd27c38569b6d907b8f93bd7833',1,'std::default_delete< _Tp[]>::operator()'],['https://docs.opencv.org/4.2.0/da/d32/structcv_1_1cudev_1_1abs__func.html#a94901ba987a4b13f76d6c512ff67630f',1,'cv::cudev::abs_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/d17/structcv_1_1cudev_1_1abs__func_3_01double_01_4.html#a09324ee98e693e096ffbf16186d54406',1,'cv::cudev::abs_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d75/structcv_1_1cudev_1_1abs__func_3_01float_01_4.html#a61ef7062be465ef121b724f7c612e100',1,'cv::cudev::abs_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d3/dc9/structcv_1_1cudev_1_1abs__func_3_01schar_01_4.html#a33a00f9fd47140d763c362d2d8754ef5',1,'cv::cudev::abs_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d2b/structcv_1_1cudev_1_1abs__func_3_01short_01_4.html#ab273409438d23ecf6a7deee0a1ceb338',1,'cv::cudev::abs_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d6e/structcv_1_1cudev_1_1abs__func_3_01uchar_01_4.html#a087883df9c5e8aa99a6e686a2a42ee30',1,'cv::cudev::abs_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d98/structcv_1_1cudev_1_1abs__func_3_01uint_01_4.html#a6194e5eba6a05ab9fef48ef29855ad22',1,'cv::cudev::abs_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/da7/structcv_1_1cudev_1_1abs__func_3_01ushort_01_4.html#a230f31a23cac7d7b75e8f1b8b32ad1dc',1,'cv::cudev::abs_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/da1/structcv_1_1cudev_1_1absdiff__func.html#ab501011fd7f3950a7db1bff0e6c4f739',1,'cv::cudev::absdiff_func::operator()()'],['https://docs.opencv.org/4.2.0/de/dae/structcv_1_1cudev_1_1acos__func.html#a00573ba47210264bc9812c7e2fbb1676',1,'cv::cudev::acos_func::operator()()'],['https://docs.opencv.org/4.2.0/d0/d62/structcv_1_1cudev_1_1acos__func_3_01double_01_4.html#a35dd825ad75c47ace1929b2b478705cb',1,'cv::cudev::acos_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd0/structcv_1_1cudev_1_1acos__func_3_01float_01_4.html#a72e654a25abffc81ac465c0b62f751ab',1,'cv::cudev::acos_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d4/dc1/structcv_1_1cudev_1_1acos__func_3_01schar_01_4.html#a751cd34b926ea535d1c4ae85115b3ad3',1,'cv::cudev::acos_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d80/structcv_1_1cudev_1_1acos__func_3_01short_01_4.html#ab8a75a695c451fee16cf582bb37be3a7',1,'cv::cudev::acos_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1acos__func_3_01uchar_01_4.html#a41864404742e2b57a5d61bfaedc6930b',1,'cv::cudev::acos_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dc0/structcv_1_1cudev_1_1acos__func_3_01uint_01_4.html#af21480a7802d4fcdb548d815d2732108',1,'cv::cudev::acos_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/de/d57/structcv_1_1cudev_1_1acos__func_3_01ushort_01_4.html#ace440e4c06446bf686bdf56aaa61e370',1,'cv::cudev::acos_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/da/d97/structcv_1_1cudev_1_1acosh__func.html#a6902cdcdfeff1b7173d4cfffd32d7e03',1,'cv::cudev::acosh_func::operator()()'],['https://docs.opencv.org/4.2.0/d6/de9/structcv_1_1cudev_1_1acosh__func_3_01double_01_4.html#adcdbcc1362f625ca203505bc291a8a3c',1,'cv::cudev::acosh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/de/d89/structcv_1_1cudev_1_1acosh__func_3_01float_01_4.html#a8982e72923a845633808910076483761',1,'cv::cudev::acosh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d52/structcv_1_1cudev_1_1acosh__func_3_01schar_01_4.html#ae815dc363c798f86c639fdbee64d53dc',1,'cv::cudev::acosh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d61/structcv_1_1cudev_1_1acosh__func_3_01short_01_4.html#a7591548bc937a985b6beb8f616ed3eed',1,'cv::cudev::acosh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d17/structcv_1_1cudev_1_1acosh__func_3_01uchar_01_4.html#ab9166b320e5284bbc93311576451082f',1,'cv::cudev::acosh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/de/d8f/structcv_1_1cudev_1_1acosh__func_3_01uint_01_4.html#ae1379c0c1004182761438b8759767f55',1,'cv::cudev::acosh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/db8/structcv_1_1cudev_1_1acosh__func_3_01ushort_01_4.html#aa7121ef1b36d0b4308d6fb954af64194',1,'cv::cudev::acosh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d2a/structcv_1_1cudev_1_1AffineMapPtr.html#a4445dd8e26b3ab12dd94b0a03459f8c7',1,'cv::cudev::AffineMapPtr::operator()()'],['https://docs.opencv.org/4.2.0/d9/dee/structcv_1_1cudev_1_1asin__func.html#ad0dadefec255a3fab08b7b6951976147',1,'cv::cudev::asin_func::operator()()'],['https://docs.opencv.org/4.2.0/d6/d59/structcv_1_1cudev_1_1asin__func_3_01double_01_4.html#ae6b289475377426443000524d7c90085',1,'cv::cudev::asin_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d96/structcv_1_1cudev_1_1asin__func_3_01float_01_4.html#a96523634a121003c18ef94ff4034e750',1,'cv::cudev::asin_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d9/da3/structcv_1_1cudev_1_1asin__func_3_01schar_01_4.html#a0894abd85f1e7283ec0d7987e83870a4',1,'cv::cudev::asin_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d16/structcv_1_1cudev_1_1asin__func_3_01short_01_4.html#ac71145c2171d2ac723c9ea4bc122fd2d',1,'cv::cudev::asin_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/da/d71/structcv_1_1cudev_1_1asin__func_3_01uchar_01_4.html#a6de9805df271a327d045d0423d9b0b7f',1,'cv::cudev::asin_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d65/structcv_1_1cudev_1_1asin__func_3_01uint_01_4.html#a67ae0549ed7d2d8bfcf3f12fbe27f0d9',1,'cv::cudev::asin_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d46/structcv_1_1cudev_1_1asin__func_3_01ushort_01_4.html#ae72849100ba9499ef28b6474b147c639',1,'cv::cudev::asin_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d43/structcv_1_1cudev_1_1asinh__func.html#a3dfa1b292a19d188f40bfe6023044c77',1,'cv::cudev::asinh_func::operator()()'],['https://docs.opencv.org/4.2.0/d7/da8/structcv_1_1cudev_1_1asinh__func_3_01double_01_4.html#ae1635d4b05cded16135c4fdf03708e55',1,'cv::cudev::asinh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d1c/structcv_1_1cudev_1_1asinh__func_3_01float_01_4.html#a854f649e9681f1e6f1c5ae814e53f729',1,'cv::cudev::asinh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/db/db5/structcv_1_1cudev_1_1asinh__func_3_01schar_01_4.html#a6884224d8c6774ded501395c72fbe5c2',1,'cv::cudev::asinh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/df/da7/structcv_1_1cudev_1_1asinh__func_3_01short_01_4.html#aef45a37522498495bf0a4f6ccb55f1cf',1,'cv::cudev::asinh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1cudev_1_1asinh__func_3_01uchar_01_4.html#abe9fca6c5fc501aebd16b35ccdef9dcb',1,'cv::cudev::asinh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d27/structcv_1_1cudev_1_1asinh__func_3_01uint_01_4.html#ae8758ca4e6f926650c902e84e762a2a3',1,'cv::cudev::asinh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dc2/structcv_1_1cudev_1_1asinh__func_3_01ushort_01_4.html#a187311528ee4b3a4be24935b2a0a0c70',1,'cv::cudev::asinh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d8e/structcv_1_1cudev_1_1atan2__func.html#a11d690fd0a2f0d1169808d70e768c7b9',1,'cv::cudev::atan2_func::operator()()'],['https://docs.opencv.org/4.2.0/d8/d15/structcv_1_1cudev_1_1atan2__func_3_01double_01_4.html#ab78ab22ad26665bd7c9832006b3f39b0',1,'cv::cudev::atan2_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d0/df1/structcv_1_1cudev_1_1atan2__func_3_01float_01_4.html#a90ec967495f0b7d8067ca7a8256b0dfe',1,'cv::cudev::atan2_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/da/da9/structcv_1_1cudev_1_1atan2__func_3_01schar_01_4.html#abbf914a1e06e67bbd24d10519212b0b4',1,'cv::cudev::atan2_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d9/dc9/structcv_1_1cudev_1_1atan2__func_3_01short_01_4.html#a2a2a614f5878ff865689740cb2068161',1,'cv::cudev::atan2_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d3/d1d/structcv_1_1cudev_1_1atan2__func_3_01uchar_01_4.html#a13984771ed43545e79b89929980d1e12',1,'cv::cudev::atan2_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d4a/structcv_1_1cudev_1_1atan2__func_3_01uint_01_4.html#a86eb842a0331b8d78aaf9d549f7f9e60',1,'cv::cudev::atan2_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d3/d2f/structcv_1_1cudev_1_1atan2__func_3_01ushort_01_4.html#aac55a6e3c6029d3e78c55621ba4da3b3',1,'cv::cudev::atan2_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/df/d91/structcv_1_1cudev_1_1atan__func.html#aaf59131d17cd6f8e0460b27ab2c3a592',1,'cv::cudev::atan_func::operator()()'],['https://docs.opencv.org/4.2.0/d4/d8e/structcv_1_1cudev_1_1atan__func_3_01double_01_4.html#a7a4e8cda92da1627965c13cf5a7e5bd6',1,'cv::cudev::atan_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dc1/structcv_1_1cudev_1_1atan__func_3_01float_01_4.html#a9dd06696f21326f73219a9676da4cadb',1,'cv::cudev::atan_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d4a/structcv_1_1cudev_1_1atan__func_3_01schar_01_4.html#a2ace3f94c175ba447f5ff3491bbc0f4a',1,'cv::cudev::atan_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d20/structcv_1_1cudev_1_1atan__func_3_01short_01_4.html#a94ca8f0722bdd8644dc260d770717c97',1,'cv::cudev::atan_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/dd/dce/structcv_1_1cudev_1_1atan__func_3_01uchar_01_4.html#afc69d55cb3f353d36edb4a009e6a489b',1,'cv::cudev::atan_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/de6/structcv_1_1cudev_1_1atan__func_3_01uint_01_4.html#a1d4d42bb9b4aa669b985bbbcf2279fd7',1,'cv::cudev::atan_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d1/da0/structcv_1_1cudev_1_1atan__func_3_01ushort_01_4.html#a5ec7b0f0f0ec3e89c8647d985de6a508',1,'cv::cudev::atan_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1cudev_1_1atanh__func.html#a7edb319d3025314f194ed524445ecbb4',1,'cv::cudev::atanh_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/d41/structcv_1_1cudev_1_1atanh__func_3_01double_01_4.html#aa8e199a08e43ec0d5171a69d7338d9d2',1,'cv::cudev::atanh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d2d/structcv_1_1cudev_1_1atanh__func_3_01float_01_4.html#a153da89a9a6d590316ad349f95427817',1,'cv::cudev::atanh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd6/structcv_1_1cudev_1_1atanh__func_3_01schar_01_4.html#acc9242ab80f0ab4475bb28138cc36707',1,'cv::cudev::atanh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1cudev_1_1atanh__func_3_01short_01_4.html#a3bbe7f572ee9bd3a177b840e62d91f7e',1,'cv::cudev::atanh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d90/structcv_1_1cudev_1_1atanh__func_3_01uchar_01_4.html#a1bc8a25394326dca443aafe1dacd79b2',1,'cv::cudev::atanh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/ddc/structcv_1_1cudev_1_1atanh__func_3_01uint_01_4.html#abab90e89b20be773fa2ec8b9c117bdce',1,'cv::cudev::atanh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dd0/structcv_1_1cudev_1_1atanh__func_3_01ushort_01_4.html#a405304579640281e82b10a1b1a7dce8b',1,'cv::cudev::atanh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1detail_1_1BestOf2NearestRangeMatcher.html#a66deb1783f81d32e61e64533aa03e103',1,'cv::detail::BestOf2NearestRangeMatcher::operator()()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#aceb00c1f30edf4b763d510e88a2bd0e1',1,'cv::line_descriptor::BinaryDescriptor::operator()()'],['https://docs.opencv.org/4.2.0/d1/d81/structcv_1_1cudev_1_1BinaryNegate.html#a36756888244e5ef22f86fd4c49fc7a15',1,'cv::cudev::BinaryNegate::operator()()'],['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#ae37dde0385c22b65a264ab65c21f39b9',1,'cv::cudev::BinaryTransformPtr::operator()()'],['https://docs.opencv.org/4.2.0/dc/da3/structcv_1_1cudev_1_1BinaryTupleAdapter.html#a991d05c3c6bdc3cad44d5c06bdb98a51',1,'cv::cudev::BinaryTupleAdapter::operator()()'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1Binder1st.html#a961f08f309d5aee4e0aeaab104903b80',1,'cv::cudev::Binder1st::operator()()'],['https://docs.opencv.org/4.2.0/d6/db4/structcv_1_1cudev_1_1Binder2nd.html#ad0467cfe7ff80497c4d75dfe802bfc6d',1,'cv::cudev::Binder2nd::operator()()'],['https://docs.opencv.org/4.2.0/d9/de7/structcv_1_1cudev_1_1bit__and.html#af7f2f2bbf763662ba9f6ad6d715325b2',1,'cv::cudev::bit_and::operator()()'],['https://docs.opencv.org/4.2.0/d3/d65/structcv_1_1cudev_1_1bit__lshift.html#a319adce84f53f86c628d35bbbf4a6a8f',1,'cv::cudev::bit_lshift::operator()()'],['https://docs.opencv.org/4.2.0/d0/d8a/structcv_1_1cudev_1_1bit__not.html#a54dd18d632ab34ca40cfa34051c6837b',1,'cv::cudev::bit_not::operator()()'],['https://docs.opencv.org/4.2.0/dd/d1c/structcv_1_1cudev_1_1bit__or.html#a9f4238b0c69f7b11dceade45b5e725e7',1,'cv::cudev::bit_or::operator()()'],['https://docs.opencv.org/4.2.0/d4/d2a/structcv_1_1cudev_1_1bit__rshift.html#ab4777501448c008710af761884857af7',1,'cv::cudev::bit_rshift::operator()()'],['https://docs.opencv.org/4.2.0/df/d44/structcv_1_1cudev_1_1bit__xor.html#aae72022cafd71a432dcd395a79ea93c0',1,'cv::cudev::bit_xor::operator()()'],['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#a9d17dbeddaa46c18fa0fa4e4a9e75db3',1,'cv::cudev::BrdBase::operator()()'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#a848eeec7df49f12d767c8460e7d571b4',1,'cv::cudev::BrdConstant::operator()()'],['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html#af6aaa70f1767009aca371d0a195a897f',1,'cv::stereo::CensusKernel::operator()()'],['https://docs.opencv.org/4.2.0/d4/d5b/classcv_1_1stereo_1_1CombinedDescriptor.html#ab5cf7d0c8c4072e3284fc6d140f8675c',1,'cv::stereo::CombinedDescriptor::operator()()'],['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#a59488b025a29244f32bb13b8e88ca9c8',1,'cv::cudev::CommonAreaInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d5/db7/structcv_1_1cudev_1_1ConstantPtr.html#ab9fdee7febaee40d0a8d84dc03e683f6',1,'cv::cudev::ConstantPtr::operator()()'],['https://docs.opencv.org/4.2.0/d6/dfb/structcv_1_1cudev_1_1cos__func.html#a988f8089a8b8d195a2ff3bd00b83d46f',1,'cv::cudev::cos_func::operator()()'],['https://docs.opencv.org/4.2.0/db/d23/structcv_1_1cudev_1_1cos__func_3_01double_01_4.html#aaf9cfdadc2fdf132ce1c6fd1bc4d23c7',1,'cv::cudev::cos_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d7a/structcv_1_1cudev_1_1cos__func_3_01float_01_4.html#aabb752915736cacff3b15eb91a1cc4c5',1,'cv::cudev::cos_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d25/structcv_1_1cudev_1_1cos__func_3_01schar_01_4.html#a1e26eec7e6cf6e3cf0ddfcd4d150f10e',1,'cv::cudev::cos_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d03/structcv_1_1cudev_1_1cos__func_3_01short_01_4.html#a97f88f391e8eccee42251572d6917d39',1,'cv::cudev::cos_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d3d/structcv_1_1cudev_1_1cos__func_3_01uchar_01_4.html#a693d78041e8f0eb86a521d7ea868aaa6',1,'cv::cudev::cos_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/da/dc1/structcv_1_1cudev_1_1cos__func_3_01uint_01_4.html#a2fe66a37f8017659d4528d44361536d8',1,'cv::cudev::cos_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/df/d35/structcv_1_1cudev_1_1cos__func_3_01ushort_01_4.html#ae58914f83f44a50534220d0496c6f134',1,'cv::cudev::cos_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d8a/structcv_1_1cudev_1_1cosh__func.html#a2762fccc8bcb7c73e5029fb2ca79e9b0',1,'cv::cudev::cosh_func::operator()()'],['https://docs.opencv.org/4.2.0/d5/d3a/structcv_1_1cudev_1_1cosh__func_3_01double_01_4.html#a1a46775b2bbfbad92506fb451ee1c79d',1,'cv::cudev::cosh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/db/d8d/structcv_1_1cudev_1_1cosh__func_3_01float_01_4.html#a1ee29ef52dc2cf4be6d5e6270503bea5',1,'cv::cudev::cosh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/df/dd8/structcv_1_1cudev_1_1cosh__func_3_01schar_01_4.html#a7f79b5591445191cb72512e705306d72',1,'cv::cudev::cosh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d8a/structcv_1_1cudev_1_1cosh__func_3_01short_01_4.html#a73e6537c788b836c602d48c0dbf79e38',1,'cv::cudev::cosh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/de/d73/structcv_1_1cudev_1_1cosh__func_3_01uchar_01_4.html#ab4369c5946fe73e32b0eec7f6b77ad75',1,'cv::cudev::cosh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/ddd/structcv_1_1cudev_1_1cosh__func_3_01uint_01_4.html#a43b76700e20129190cc77111c02e53e4',1,'cv::cudev::cosh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd3/structcv_1_1cudev_1_1cosh__func_3_01ushort_01_4.html#a0171124ee451386c0d600734bd840401',1,'cv::cudev::cosh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1CubicInterPtr.html#ab39bee06ee1a2be6a2e38a7d369a716f',1,'cv::cudev::CubicInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#ab5bd6ed0b55f60a2c96b18824f7438dd',1,'cv::CvFeatureEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#aa58bba803ef918036facf78ca50c403c',1,'cv::CvHaarEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga68c6b644dd17b10637cf74117c44e35e',1,'cv::CvHOGEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#a838cd13385f89f2cda2643857d1f34b5',1,'cv::CvLBPEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/d0/d90/structcv_1_1DefaultDeleter_3_01CvCapture_01_4.html#a36b7e1f33f49b098f807f8581b1473a7',1,'cv::DefaultDeleter< CvCapture >::operator()()'],['https://docs.opencv.org/4.2.0/d9/ddf/structcv_1_1DefaultDeleter_3_01CvHaarClassifierCascade_01_4.html#a44656fba99887584e8bc88775dc4888a',1,'cv::DefaultDeleter< CvHaarClassifierCascade >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d37/structcv_1_1DefaultDeleter_3_01CvVideoWriter_01_4.html#a28a310125686255f0149c04ce70ea48e',1,'cv::DefaultDeleter< CvVideoWriter >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#ab006210fdd363a9b0c42f5c11433398d',1,'cv::rgbd::DepthCleaner::operator()()'],['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1cudev_1_1DerivXPtr.html#af9c609af8dbdb0ce6db7e5a9020ec9c0',1,'cv::cudev::DerivXPtr::operator()()'],['https://docs.opencv.org/4.2.0/dc/d51/structcv_1_1cudev_1_1DerivYPtr.html#a1ae2a1e12cc4916fe99f0330eaeb61fd',1,'cv::cudev::DerivYPtr::operator()()'],['https://docs.opencv.org/4.2.0/d3/d97/structcv_1_1cudev_1_1direction__func.html#a2155dbec5fdc65714b561ce94620691a',1,'cv::cudev::direction_func::operator()()'],['https://docs.opencv.org/4.2.0/de/d2a/structcv_1_1cudev_1_1divides.html#a1cd06b89048d107490992a1531fd2a34',1,'cv::cudev::divides::operator()()'],['https://docs.opencv.org/4.2.0/d2/dfd/structcv_1_1cudev_1_1equal__to.html#aa8931c7ed8ea7e2604c38b704b9dfb82',1,'cv::cudev::equal_to::operator()()'],['https://docs.opencv.org/4.2.0/df/d15/classcv_1_1detail_1_1Estimator.html#a0924447fc99df3360b6f005a7c0aa437',1,'cv::detail::Estimator::operator()()'],['https://docs.opencv.org/4.2.0/dc/d8b/structcv_1_1cudev_1_1exp10__func.html#a071ded47294be622de0150f258efd229',1,'cv::cudev::exp10_func::operator()()'],['https://docs.opencv.org/4.2.0/d0/d66/structcv_1_1cudev_1_1exp10__func_3_01double_01_4.html#a626097f0778f1a40babc5517ddb8153a',1,'cv::cudev::exp10_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d78/structcv_1_1cudev_1_1exp10__func_3_01float_01_4.html#afa1c84f89716f836ef03262a078fcdab',1,'cv::cudev::exp10_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dde/structcv_1_1cudev_1_1exp10__func_3_01schar_01_4.html#af0f0403c9cd63a22d8f38071b47485ab',1,'cv::cudev::exp10_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1exp10__func_3_01short_01_4.html#a3ec1f45ae0cdb736f23b16925812d758',1,'cv::cudev::exp10_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d1/ddd/structcv_1_1cudev_1_1exp10__func_3_01uchar_01_4.html#aaccfbfbcf2c5636b4ebcffb40b744427',1,'cv::cudev::exp10_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/dc3/structcv_1_1cudev_1_1exp10__func_3_01uint_01_4.html#aef6b50b90e3757e58b6cd47fd83eaeff',1,'cv::cudev::exp10_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d4/da4/structcv_1_1cudev_1_1exp10__func_3_01ushort_01_4.html#a2432a747a7d34541301142a46460a7e2',1,'cv::cudev::exp10_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/dd9/structcv_1_1cudev_1_1exp2__func.html#a7a72f8aa55099dd88aa51a6e2bf51730',1,'cv::cudev::exp2_func::operator()()'],['https://docs.opencv.org/4.2.0/d8/d9b/structcv_1_1cudev_1_1exp2__func_3_01double_01_4.html#aa8b8ebaa15b369605febaf2943a48534',1,'cv::cudev::exp2_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dc7/structcv_1_1cudev_1_1exp2__func_3_01float_01_4.html#a76a28168041a40040a59dbe5fcf80ede',1,'cv::cudev::exp2_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/de/da5/structcv_1_1cudev_1_1exp2__func_3_01schar_01_4.html#ab6cd4172be5a97a114e658ee7d8e8d94',1,'cv::cudev::exp2_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/da/d29/structcv_1_1cudev_1_1exp2__func_3_01short_01_4.html#a802f2e62fad66e331f08ed2d50ae420f',1,'cv::cudev::exp2_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d8b/structcv_1_1cudev_1_1exp2__func_3_01uchar_01_4.html#ad1357ddfd7831d00bf1716a740a10b7e',1,'cv::cudev::exp2_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/dc/dd4/structcv_1_1cudev_1_1exp2__func_3_01uint_01_4.html#afba60094be1fee3c426c31fe0c028aea',1,'cv::cudev::exp2_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d30/structcv_1_1cudev_1_1exp2__func_3_01ushort_01_4.html#acd9f9bdf9f2f21c3e4ddda350e62026c',1,'cv::cudev::exp2_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d73/structcv_1_1cudev_1_1exp__func.html#ab52d8176579e6d655d820a20360dc305',1,'cv::cudev::exp_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/db1/structcv_1_1cudev_1_1exp__func_3_01double_01_4.html#ad391b31dd35af417fe08dc8761676b1d',1,'cv::cudev::exp_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/df/dba/structcv_1_1cudev_1_1exp__func_3_01float_01_4.html#adc085ebcc030437fec9cc33766e62b45',1,'cv::cudev::exp_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d33/structcv_1_1cudev_1_1exp__func_3_01schar_01_4.html#ad3a33474b50895c9ea0de63bcc01bd31',1,'cv::cudev::exp_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d67/structcv_1_1cudev_1_1exp__func_3_01short_01_4.html#a537df0eeb7a971b7196baf6b1fbe8b46',1,'cv::cudev::exp_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d9/de4/structcv_1_1cudev_1_1exp__func_3_01uchar_01_4.html#aba3778efd452fe016b2551ae25a9e0bd',1,'cv::cudev::exp_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1exp__func_3_01uint_01_4.html#ab1ca81dfae2fa4613035d53d71337b2e',1,'cv::cudev::exp_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dde/structcv_1_1cudev_1_1exp__func_3_01ushort_01_4.html#a07d2ad1cb4b3aa588eb4ffc44a18cef8',1,'cv::cudev::exp_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/df/db2/classcv_1_1cuda_1_1FastOpticalFlowBM.html#ac149a65983f02fa91a5a7a53eb232cf2',1,'cv::cuda::FastOpticalFlowBM::operator()()'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a5d5793f2f71bae1cb72acc3e95d069df',1,'cv::detail::FeaturesMatcher::operator()(const ImageFeatures &features1, const ImageFeatures &features2, MatchesInfo &matches_info)'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a2df19558a646700d9543841cafae4bc2',1,'cv::detail::FeaturesMatcher::operator()(const std::vector< ImageFeatures > &features, std::vector< MatchesInfo > &pairwise_matches, const cv::UMat &mask=cv::UMat())'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ad2ed48a66be94fae14bc3a2a08ea8e95',1,'cv::GCompiled::operator()(GRunArgs &&ins, GRunArgsP &&outs)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a8ada1c617461a8b366b997be5c438d4a',1,'cv::GCompiled::operator()(cv::Mat in, cv::Mat &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a68bcf146b1479be128ee4bb39035fc43',1,'cv::GCompiled::operator()(cv::Mat in, cv::Scalar &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a7878a8cf7a6e5f5542777c8e1b5c977a',1,'cv::GCompiled::operator()(cv::Mat in1, cv::Mat in2, cv::Mat &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ac7ea0e242325db157f9dc95cf2c47845',1,'cv::GCompiled::operator()(cv::Mat in1, cv::Mat in2, cv::Scalar &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#aa4751e20cd8fa27947b073366d3c130c',1,'cv::GCompiled::operator()(const std::vector< cv::Mat > &ins, const std::vector< cv::Mat > &outs)'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#a8a2d9c2741c247165e1778a35eeedec7',1,'cv::cudev::GlobPtr::operator()(int y, int x)'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#a630b28b0982df38fa4a8370df54c8876',1,'cv::cudev::GlobPtr::operator()(int y, int x) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a2b3c25e36b0f82ca8f9f74b6ae68c41d',1,'cv::cuda::GpuMat::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a217e27e7051bed168c34ba767915cc63',1,'cv::cuda::GpuMat::operator()(Rect roi) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#aa1ccd7742a80a4f084c78f1d61601073',1,'cv::cudev::GpuMat_::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a5770b11d962d14d542b915f81441ccb4',1,'cv::cudev::GpuMat_::operator()(Rect roi) const'],['https://docs.opencv.org/4.2.0/d9/d1c/structcv_1_1cudev_1_1greater.html#a094203d3b37c3c215eac4c0250577dd3',1,'cv::cudev::greater::operator()()'],['https://docs.opencv.org/4.2.0/dd/d08/structcv_1_1cudev_1_1greater__equal.html#af19f72ea85d3d1fbff57c2cbe0cbb05e',1,'cv::cudev::greater_equal::operator()()'],['https://docs.opencv.org/4.2.0/d3/d59/structcv_1_1Hamming.html#a3d6ec47bfdc0d89f191428ccbfe00823',1,'cv::Hamming::operator()()'],['https://docs.opencv.org/4.2.0/d3/d10/structstd_1_1hash_3_01cv_1_1gapi_1_1GBackend_01_4.html#a5064b9ea589368a0f1814598cfcb67c8',1,'std::hash< cv::gapi::GBackend >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d99/structstd_1_1hash_3_01cv_1_1GShape_01_4.html#aabcf77cfe57beafe3afffb118967829a',1,'std::hash< cv::GShape >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d3e/structcv_1_1cudev_1_1hypot__func.html#a2f42ede8772f0144017fbfc07486947d',1,'cv::cudev::hypot_func::operator()()'],['https://docs.opencv.org/4.2.0/d6/d05/structcv_1_1cudev_1_1hypot__func_3_01double_01_4.html#ac8bf27e184911fc704e88916c649111c',1,'cv::cudev::hypot_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d37/structcv_1_1cudev_1_1hypot__func_3_01float_01_4.html#a66cf4ee063a301dc96ee60077be2294f',1,'cv::cudev::hypot_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/df/dbd/structcv_1_1cudev_1_1hypot__func_3_01schar_01_4.html#aaf99e66892b49d09d373efd1f40fa989',1,'cv::cudev::hypot_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d0b/structcv_1_1cudev_1_1hypot__func_3_01short_01_4.html#a09105d3f2332f484875c304fba5bcc0e',1,'cv::cudev::hypot_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/db0/structcv_1_1cudev_1_1hypot__func_3_01uchar_01_4.html#aa16959b94a6a1da0516f20fefa457cca',1,'cv::cudev::hypot_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dad/structcv_1_1cudev_1_1hypot__func_3_01uint_01_4.html#a6f4a739bd0d21bd64e163cfb091fc3e2',1,'cv::cudev::hypot_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d26/structcv_1_1cudev_1_1hypot__func_3_01ushort_01_4.html#a32ad689516093e2d048d47e1775e71bf',1,'cv::cudev::hypot_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/df/d22/structcv_1_1cudev_1_1identity.html#ae8e53f80a081edd0156421f7e502674a',1,'cv::cudev::identity::operator()()'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#ab439f549a54e7fb4d077d51e26fc1e81',1,'cv::cudev::IntegerAreaInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1L1.html#a6e1989c64affb81cd157f49f9b8b93b0',1,'cv::L1::operator()()'],['https://docs.opencv.org/4.2.0/dc/daa/structcv_1_1L2.html#a1bd9f1b3a846126410d188c72645c25d',1,'cv::L2::operator()()'],['https://docs.opencv.org/4.2.0/d0/de6/structcv_1_1cudev_1_1LaplacianPtr_3_011_00_01SrcPtr_01_4.html#a378fe7b55d2ee57979706e7cbd3a3dde',1,'cv::cudev::LaplacianPtr< 1, SrcPtr >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d89/structcv_1_1cudev_1_1LaplacianPtr_3_013_00_01SrcPtr_01_4.html#af02fec60f0690261a54910e6e1ca5542',1,'cv::cudev::LaplacianPtr< 3, SrcPtr >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d04/structcv_1_1cudev_1_1less.html#aef70d1d8dee6dca98128735c2a60f486',1,'cv::cudev::less::operator()()'],['https://docs.opencv.org/4.2.0/d1/d03/structcv_1_1cudev_1_1less__equal.html#a35cab8e57e6e215821e61ed7d116045e',1,'cv::cudev::less_equal::operator()()'],['https://docs.opencv.org/4.2.0/d7/d8a/structcv_1_1cudev_1_1LinearInterPtr.html#a354dbbfbda853a6497da10ac614732ea',1,'cv::cudev::LinearInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d8/da8/structcv_1_1cudev_1_1log10__func.html#a8ed0d87633e88b1e5ec26ccb62017a84',1,'cv::cudev::log10_func::operator()()'],['https://docs.opencv.org/4.2.0/dc/d32/structcv_1_1cudev_1_1log10__func_3_01double_01_4.html#a55aa0560ae5a0fc01487540ff1658e87',1,'cv::cudev::log10_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d42/structcv_1_1cudev_1_1log10__func_3_01float_01_4.html#ae7011f3b9f7529c765c6d4433e93d9bc',1,'cv::cudev::log10_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d4b/structcv_1_1cudev_1_1log10__func_3_01schar_01_4.html#ab04065a7b741671ea7050e5367a94362',1,'cv::cudev::log10_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d00/structcv_1_1cudev_1_1log10__func_3_01short_01_4.html#a4490ba24cdd88c8c1708830583aef024',1,'cv::cudev::log10_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/dd/dcc/structcv_1_1cudev_1_1log10__func_3_01uchar_01_4.html#a4f9937403d93a32fe7d0e9b18831821c',1,'cv::cudev::log10_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/df/d6e/structcv_1_1cudev_1_1log10__func_3_01uint_01_4.html#af462996a0b52e703042273d4533983b7',1,'cv::cudev::log10_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d0/df1/structcv_1_1cudev_1_1log10__func_3_01ushort_01_4.html#aef130449d3276fedd53036bbaafe6828',1,'cv::cudev::log10_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1cudev_1_1log2__func.html#aba0f8b5ead7e4fb3e6f8c6f2cbcddca9',1,'cv::cudev::log2_func::operator()()'],['https://docs.opencv.org/4.2.0/dc/d17/structcv_1_1cudev_1_1log2__func_3_01double_01_4.html#ae825f360d7a8c1c2976ec16a52afcbe3',1,'cv::cudev::log2_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/db/dba/structcv_1_1cudev_1_1log2__func_3_01float_01_4.html#afdfb43df5d0d168e65bfa795f0654034',1,'cv::cudev::log2_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1log2__func_3_01schar_01_4.html#aeb64ee83eecff169547ebf72ff37f2f4',1,'cv::cudev::log2_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d0b/structcv_1_1cudev_1_1log2__func_3_01short_01_4.html#a7dc4e28152086625533614481d4c436f',1,'cv::cudev::log2_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d41/structcv_1_1cudev_1_1log2__func_3_01uchar_01_4.html#a169dfefed3bcccacbf67bdb20f119f5e',1,'cv::cudev::log2_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/df/d69/structcv_1_1cudev_1_1log2__func_3_01uint_01_4.html#ae44865085e382670f17536552d9f8d1a',1,'cv::cudev::log2_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d0/dda/structcv_1_1cudev_1_1log2__func_3_01ushort_01_4.html#afe1f535584f0fcaa41dd4aac88871bd9',1,'cv::cudev::log2_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d41/structcv_1_1cudev_1_1log__func.html#a943bb3c0839bc97fc724689bb0fe8651',1,'cv::cudev::log_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/dad/structcv_1_1cudev_1_1log__func_3_01double_01_4.html#ad41e4d4a49cba0a2f14ce7b44860f102',1,'cv::cudev::log_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d85/structcv_1_1cudev_1_1log__func_3_01float_01_4.html#ad9d324de3522e32adda4eed82c24669b',1,'cv::cudev::log_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d2/de1/structcv_1_1cudev_1_1log__func_3_01schar_01_4.html#a299f70fa2dc5d67e51165035904d9eb8',1,'cv::cudev::log_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d19/structcv_1_1cudev_1_1log__func_3_01short_01_4.html#a77a4daf23da2dd3f99aa6559106101b4',1,'cv::cudev::log_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d3/db5/structcv_1_1cudev_1_1log__func_3_01uchar_01_4.html#a877322f5cbcc6845276f7096a39a59d2',1,'cv::cudev::log_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d0/dee/structcv_1_1cudev_1_1log__func_3_01uint_01_4.html#a6d1fe6935269490408f023d6dbc82d80',1,'cv::cudev::log_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d0c/structcv_1_1cudev_1_1log__func_3_01ushort_01_4.html#a25d4a879c093d9c65d9ae24021a599c9',1,'cv::cudev::log_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1cudev_1_1logical__and.html#a6a80f03acb116ed9e5f3f533dd8cf1a6',1,'cv::cudev::logical_and::operator()()'],['https://docs.opencv.org/4.2.0/d4/d01/structcv_1_1cudev_1_1logical__not.html#a5d6fd2eb21769c8ab859395f9aaad133',1,'cv::cudev::logical_not::operator()()'],['https://docs.opencv.org/4.2.0/d3/db2/structcv_1_1cudev_1_1logical__or.html#a682a316f3d1c904a8b03f4132a432955',1,'cv::cudev::logical_or::operator()()'],['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html#a45ddaa9b235af7db44bb4cee9fc02a04',1,'cv::cudev::LutPtr::operator()()'],['https://docs.opencv.org/4.2.0/d1/deb/structcv_1_1cudev_1_1magnitude__func.html#a89c8b5fbcd6dfe676ac11e6e4b339287',1,'cv::cudev::magnitude_func::operator()()'],['https://docs.opencv.org/4.2.0/d3/da4/structcv_1_1cudev_1_1magnitude__sqr__func.html#aaaab7e87a8f39b310caf6f0e20a623c3',1,'cv::cudev::magnitude_sqr_func::operator()()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ad543b6bd296ae1247032c750af4718e1',1,'cv::Mat::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a4272fce43d7405603fbb5e5f52580e57',1,'cv::Mat::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aee56475f834069b1fad3877c0747aaeb',1,'cv::Mat::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa9bf4fcbb6e854a6db7b7254a205fac9',1,'cv::Mat::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#aafddf1814d6868d7c67220cf5726f932',1,'cv::gapi::own::Mat::operator()()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'cv::Mat_::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'cv::Mat_::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'cv::Mat_::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'cv::Mat_::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'cv::Mat_::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'cv::Mat_::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'cv::Mat_::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'cv::Mat_::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'cv::Mat_::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'cv::Mat_::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'cv::Mat_::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'cv::Mat_::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'cv::Mat_::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'cv::Mat_::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'cv::Mat_::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'cv::Mat_::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< double >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< double >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< double >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< double >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< double >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< double >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< double >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< double >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< double >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< double >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< double >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< double >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< double >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< double >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< double >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< double >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< float >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< float >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< float >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< float >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< float >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< float >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< float >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< float >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< float >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< float >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< float >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< float >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< float >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< float >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< float >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< float >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< uchar >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< uchar >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< uchar >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< uchar >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< uchar >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< uchar >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< uchar >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< uchar >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< uchar >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< uchar >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< uchar >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< uchar >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< uchar >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< uchar >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< uchar >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< uchar >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< unsigned char >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< unsigned char >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< unsigned char >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< unsigned char >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< unsigned char >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< unsigned char >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< unsigned char >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< unsigned char >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< unsigned char >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< unsigned char >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< unsigned char >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< unsigned char >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< unsigned char >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< unsigned char >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< unsigned char >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< unsigned char >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6bceaa05f2fea4c73bc95f4b9e7d09bf',1,'cv::MatExpr::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae3d4aa0cf6b40c5829c6377a54101068',1,'cv::MatExpr::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#abdc35c3d1d636243a9fa4b7e3a4810fe',1,'cv::MatSize::operator()()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'cv::Matx::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'cv::Matx::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'cv::Matx::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'cv::Matx::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< _Tp, cn, 1 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< _Tp, cn, 1 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< _Tp, cn, 1 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< _Tp, cn, 1 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 1, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 1, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 1, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 1, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 2, 2 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 2, 2 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 2, 2 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 2, 2 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 2, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 2, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 2, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 2, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 3, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 3, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 3, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 3, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 3, 4 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 3, 4 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 3, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 3, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 4, 4 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 4, 4 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 4, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 4, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, cn, 1 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, cn, 1 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, cn, 1 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, cn, 1 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float, 2, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float, 2, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float, 2, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float, 2, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float, 3, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float, 3, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float, 3, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float, 3, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float, cn, 1 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float, cn, 1 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float, cn, 1 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float, cn, 1 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float_type, 4, 4 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float_type, 4, 4 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float_type, 4, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float_type, 4, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d4/d31/structcv_1_1cudev_1_1maximum.html#a23944a3a9a900d9121217a9b2bd7cf1e',1,'cv::cudev::maximum::operator()()'],['https://docs.opencv.org/4.2.0/dc/d65/structcv_1_1cudev_1_1maximum_3_01double_01_4.html#aaa3ea51b43edde4613cd12bfdcb9d760',1,'cv::cudev::maximum< double >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d1e/structcv_1_1cudev_1_1maximum_3_01float_01_4.html#a38c973c79baab206514a0b3108633add',1,'cv::cudev::maximum< float >::operator()()'],['https://docs.opencv.org/4.2.0/df/df2/structcv_1_1cudev_1_1maximum_3_01schar_01_4.html#a5ec2a8da9db4e38703a428def99c26d2',1,'cv::cudev::maximum< schar >::operator()()'],['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1maximum_3_01short_01_4.html#a9d79fb3032785722e26b00a37995a045',1,'cv::cudev::maximum< short >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d84/structcv_1_1cudev_1_1maximum_3_01uchar_01_4.html#a98a3d896491e04c7d9977eed91f2362f',1,'cv::cudev::maximum< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dfa/structcv_1_1cudev_1_1maximum_3_01uint_01_4.html#a6f78b59b8fde2766a8827de3f01d8db8',1,'cv::cudev::maximum< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d0/dac/structcv_1_1cudev_1_1maximum_3_01ushort_01_4.html#a5bda4bdb72d47bcb77ff15390922e450',1,'cv::cudev::maximum< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a8c678dd239c97b2fd12611f1363900f0',1,'cv::stereo::MCTKernel::operator()()'],['https://docs.opencv.org/4.2.0/de/d9b/classcv_1_1stereo_1_1MeanKernelIntegralImage.html#a806da8fa9a91098398f78c36d79e3991',1,'cv::stereo::MeanKernelIntegralImage::operator()()'],['https://docs.opencv.org/4.2.0/d5/dc9/structcv_1_1cudev_1_1minimum.html#acdf2ef08e5d48af75d2122e8671aea68',1,'cv::cudev::minimum::operator()()'],['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1minimum_3_01double_01_4.html#a48a0b885006be6a0fa8e9d11c54d4e5b',1,'cv::cudev::minimum< double >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d9d/structcv_1_1cudev_1_1minimum_3_01float_01_4.html#a8fbc1f931bb9d8d68e623e7bc561382a',1,'cv::cudev::minimum< float >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d75/structcv_1_1cudev_1_1minimum_3_01schar_01_4.html#a8f420b811fad523efc6aa53007d6d966',1,'cv::cudev::minimum< schar >::operator()()'],['https://docs.opencv.org/4.2.0/db/d5b/structcv_1_1cudev_1_1minimum_3_01short_01_4.html#af73ef8474d4331959f890e839e0c6253',1,'cv::cudev::minimum< short >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d48/structcv_1_1cudev_1_1minimum_3_01uchar_01_4.html#a7deb2150864ae4502dc4441bc12d4336',1,'cv::cudev::minimum< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1cudev_1_1minimum_3_01uint_01_4.html#adf25e14f21fe7eb1537a294d819d79d1',1,'cv::cudev::minimum< uint >::operator()()'],['https://docs.opencv.org/4.2.0/de/dfa/structcv_1_1cudev_1_1minimum_3_01ushort_01_4.html#ac33cd62d0c0ebbeed517eab9d577517d',1,'cv::cudev::minimum< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/da/df1/structcv_1_1cudev_1_1minus.html#aa2c21f87c2bc60ae0d5c5d7770b023c8',1,'cv::cudev::minus::operator()()'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#a33ef2dffc9591c30f8fee5f6b5ae7e04',1,'cv::stereo::ModifiedCsCensus::operator()()'],['https://docs.opencv.org/4.2.0/d7/d7f/structcv_1_1cudev_1_1modulus.html#adbb9a4b035592f32258f013f378d50dd',1,'cv::cudev::modulus::operator()()'],['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1cudev_1_1multiplies.html#ae098f5637977e29132fbb3a8607921a9',1,'cv::cudev::multiplies::operator()()'],['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#a2e082e01e62b186decf5a1f58884dd80',1,'cv::stereo::MVKernel::operator()()'],['https://docs.opencv.org/4.2.0/d0/df5/structcv_1_1cudev_1_1NearestInterPtr.html#afa902e3d702382f0a68112d8342b24f3',1,'cv::cudev::NearestInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1negate.html#a9729e5847cd4d6004ac225e156cdbe86',1,'cv::cudev::negate::operator()()'],['https://docs.opencv.org/4.2.0/df/d9f/structcv_1_1cudev_1_1not__equal__to.html#ac80d0c172252fb5bc65ed4671113ea23',1,'cv::cudev::not_equal_to::operator()()'],['https://docs.opencv.org/4.2.0/d2/d74/classcv_1_1ParallelLoopBody.html#a90285bcea9c56345622bfd6817d41b1f',1,'cv::ParallelLoopBody::operator()()'],['https://docs.opencv.org/4.2.0/d3/d78/classcv_1_1ParallelLoopBodyLambdaWrapper.html#a6b7b341ff554b63cda3e71f4481a38d7',1,'cv::ParallelLoopBodyLambdaWrapper::operator()()'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a26e76331a68988144a403649c6b8af5c',1,'cv::PCA::operator()(InputArray data, InputArray mean, int flags, int maxComponents=0)'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#aff68797b34e6edb162b0f5d1819b2e9f',1,'cv::PCA::operator()(InputArray data, InputArray mean, int flags, double retainedVariance)'],['https://docs.opencv.org/4.2.0/df/d20/structcv_1_1cudev_1_1PerspectiveMapPtr.html#aa9a16f8b9d196cbac5122f2bea12fada',1,'cv::cudev::PerspectiveMapPtr::operator()()'],['https://docs.opencv.org/4.2.0/d4/dd0/structcv_1_1cudev_1_1plus.html#a149c533def9926ab9d6e6ca57257068a',1,'cv::cudev::plus::operator()()'],['https://docs.opencv.org/4.2.0/da/dda/structcv_1_1cudev_1_1pow__func.html#a4fe691da815bb8f351f6816e4ad7311a',1,'cv::cudev::pow_func::operator()()'],['https://docs.opencv.org/4.2.0/d2/deb/structcv_1_1cudev_1_1pow__func_3_01double_01_4.html#ac79d0918dd34db9fb7703a573ae3e83c',1,'cv::cudev::pow_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d3/dea/structcv_1_1cudev_1_1project1st.html#ab10af9ecf413990340288b5d49d8314e',1,'cv::cudev::project1st::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd5/structcv_1_1cudev_1_1project2nd.html#a33823b1e54a8d5b4085163083b7a460d',1,'cv::cudev::project2nd::operator()()'],['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html#a83f91a025a0f41d3a0b528478a3cb532',1,'cv::cudev::RemapPtr1::operator()()'],['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#ab539f18b7ebc19adf055670324c2bc09',1,'cv::cudev::RemapPtr2::operator()()'],['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#aa890dd8d7b5108f77108b0f3dbf2d87f',1,'cv::cudev::ResizePtr::operator()()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a48c33f26d8662a1b3becfda60292ac5c',1,'cv::rgbd::RgbdNormals::operator()()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a1a638d0a9367b86bc56b98b9e550b9dc',1,'cv::rgbd::RgbdPlane::operator()(InputArray points3d, InputArray normals, OutputArray mask, OutputArray plane_coefficients)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a8c519cbffd2b296330b1ef5081530968',1,'cv::rgbd::RgbdPlane::operator()(InputArray points3d, OutputArray mask, OutputArray plane_coefficients)'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a16ca31c8e2ec0990df323b442ab09e4f',1,'cv::RNG::operator()()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#ac0112dc300696b1fc7998d37f15dd733',1,'cv::RNG::operator()(unsigned N)'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a5102b5f43fc7c2997f2d2bc6b693e0b4',1,'cv::RNG_MT19937::operator()(unsigned N)'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#aa52601c233cda79131052299a88ad9c2',1,'cv::RNG_MT19937::operator()()'],['https://docs.opencv.org/4.2.0/d3/d11/structcv_1_1cudev_1_1saturate__cast__fp16__func_3_01float_00_01short_01_4.html#a535ca2a5e7cf42d0da2d17fed04daf16',1,'cv::cudev::saturate_cast_fp16_func< float, short >::operator()()'],['https://docs.opencv.org/4.2.0/dc/dc5/structcv_1_1cudev_1_1saturate__cast__fp16__func_3_01short_00_01float_01_4.html#aadd03bfafa293e9fd11986416a8df232',1,'cv::cudev::saturate_cast_fp16_func< short, float >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d99/structcv_1_1cudev_1_1saturate__cast__func.html#addfef20cf8679f6924202369963bd203',1,'cv::cudev::saturate_cast_func::operator()()'],['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1ScharrXPtr.html#ad7c3ca0e1936de91a4da451b12e05461',1,'cv::cudev::ScharrXPtr::operator()()'],['https://docs.opencv.org/4.2.0/d0/d70/structcv_1_1cudev_1_1ScharrYPtr.html#a0d7970b76e5d9f21a0681ca5d794e703',1,'cv::cudev::ScharrYPtr::operator()()'],['https://docs.opencv.org/4.2.0/d1/d65/classcv_1_1SimilarRects.html#a7e70f1c43c4bf8c75851211fb50b265a',1,'cv::SimilarRects::operator()()'],['https://docs.opencv.org/4.2.0/d1/d05/structcv_1_1cudev_1_1sin__func.html#a81bbace4665b94419c862d3dcccdc280',1,'cv::cudev::sin_func::operator()()'],['https://docs.opencv.org/4.2.0/d8/d1c/structcv_1_1cudev_1_1sin__func_3_01double_01_4.html#a8b60b51b51637af0504911dc4d98e2b9',1,'cv::cudev::sin_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d2b/structcv_1_1cudev_1_1sin__func_3_01float_01_4.html#af6ea0d2d4b951bffc9a716a2265c29c9',1,'cv::cudev::sin_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d1b/structcv_1_1cudev_1_1sin__func_3_01schar_01_4.html#a78e9a2b21c9467947f65a9d27036c39f',1,'cv::cudev::sin_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d6f/structcv_1_1cudev_1_1sin__func_3_01short_01_4.html#a8c9bfa6683708b41101edd0290af9fcd',1,'cv::cudev::sin_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dfd/structcv_1_1cudev_1_1sin__func_3_01uchar_01_4.html#a73cc54b71202279bf8805e0c7f0ab847',1,'cv::cudev::sin_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/dbd/structcv_1_1cudev_1_1sin__func_3_01uint_01_4.html#a4511fade1bcfc1f7545c8c8c8c4f3b97',1,'cv::cudev::sin_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d22/structcv_1_1cudev_1_1sin__func_3_01ushort_01_4.html#a0a9f7a66d2a283b05e08ac48947d77f7',1,'cv::cudev::sin_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#a35f754723c723f5ac9ae9c6ae5ddf27d',1,'cv::cudev::SingleMaskChannels::operator()()'],['https://docs.opencv.org/4.2.0/d8/da0/structcv_1_1cudev_1_1sinh__func.html#aa12abb185d04fd4e0df2c97af973366b',1,'cv::cudev::sinh_func::operator()()'],['https://docs.opencv.org/4.2.0/db/dde/structcv_1_1cudev_1_1sinh__func_3_01double_01_4.html#ae0418acd67e1ea0a541a315623bf14fa',1,'cv::cudev::sinh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d3/df1/structcv_1_1cudev_1_1sinh__func_3_01float_01_4.html#a064843f9badf0ed3155b4231bf2ca95c',1,'cv::cudev::sinh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/de/df6/structcv_1_1cudev_1_1sinh__func_3_01schar_01_4.html#a6f95259b1094b0b7bbc5bdb47cafbfad',1,'cv::cudev::sinh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/da/d3e/structcv_1_1cudev_1_1sinh__func_3_01short_01_4.html#a01703492193b054aece7b2d8f2b11357',1,'cv::cudev::sinh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d4/dd2/structcv_1_1cudev_1_1sinh__func_3_01uchar_01_4.html#ae09891519bc4df762a12bedbcc1e41c3',1,'cv::cudev::sinh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/de/d13/structcv_1_1cudev_1_1sinh__func_3_01uint_01_4.html#a0f28cf3217ef7ae5e6be21ee888a0d2d',1,'cv::cudev::sinh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d38/structcv_1_1cudev_1_1sinh__func_3_01ushort_01_4.html#a6667d95cc7c1a83c4c9518a7848ab83d',1,'cv::cudev::sinh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html#a7a6c92810b7489377eb91727182b0e60',1,'cv::SL2::operator()()'],['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1SobelXPtr.html#a50ddaa92c615685b26263653013fffc4',1,'cv::cudev::SobelXPtr::operator()()'],['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1SobelYPtr.html#a96976834e33e5c4735361a8c62b7e68f',1,'cv::cudev::SobelYPtr::operator()()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ad7c0f0164b060df2179b3e9f1d1566a8',1,'cv::SparseMat_::operator()(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a89b99bb281a9747b54e94be670f6a010',1,'cv::SparseMat_::operator()(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ab4ffea87933a1bffcadd0db260c36846',1,'cv::SparseMat_::operator()(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ae68f3e59954cc03297b2d0e6e8ba9014',1,'cv::SparseMat_::operator()(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d9/d1d/structcv_1_1cudev_1_1sqr__func.html#a653443fdeefc72965e7ff269f28bb9dc',1,'cv::cudev::sqr_func::operator()()'],['https://docs.opencv.org/4.2.0/d9/d47/structcv_1_1cudev_1_1sqrt__func.html#a3c13827c0c81360668c03101aec9f447',1,'cv::cudev::sqrt_func::operator()()'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1cudev_1_1sqrt__func_3_01double_01_4.html#a0ed5e0351bd2e8fc4012c231307269b4',1,'cv::cudev::sqrt_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dd2/structcv_1_1cudev_1_1sqrt__func_3_01float_01_4.html#a03e90b3bb7445759653b84ccd259a22d',1,'cv::cudev::sqrt_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/da/d64/structcv_1_1cudev_1_1sqrt__func_3_01schar_01_4.html#aa4afd2cf29659cfb2e992b78aa383038',1,'cv::cudev::sqrt_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d6a/structcv_1_1cudev_1_1sqrt__func_3_01short_01_4.html#a0f6eeddb105a2097a452b52c1dfc384b',1,'cv::cudev::sqrt_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d33/structcv_1_1cudev_1_1sqrt__func_3_01uchar_01_4.html#a3196e3954b0e70277deba6b6ded42ec7',1,'cv::cudev::sqrt_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d7b/structcv_1_1cudev_1_1sqrt__func_3_01uint_01_4.html#a42e59fdead1f2063b1b06e89b3d915e9',1,'cv::cudev::sqrt_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/df/df4/structcv_1_1cudev_1_1sqrt__func_3_01ushort_01_4.html#adac64ea929bfe2d165affcbf44a767df',1,'cv::cudev::sqrt_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1stereo_1_1StarKernelCensus.html#a3d6e4998cc5b42e0fce4cc490251de9e',1,'cv::stereo::StarKernelCensus::operator()()'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a67ee54d1221b03d9866393effaeeb8dd',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, GpuMat &keypoints)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#aa0ed78380fe2142a729e424aa195263c',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, GpuMat &keypoints, GpuMat &descriptors, bool useProvidedKeypoints=false)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a9bb91e3bffd09e0e65c91c45da669304',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, std::vector< KeyPoint > &keypoints)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#aec817660a3ecbb64f0afa54354a8af5c',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, std::vector< KeyPoint > &keypoints, GpuMat &descriptors, bool useProvidedKeypoints=false)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#ad254c526ba8d61e66a40ebabf5a6c847',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, std::vector< KeyPoint > &keypoints, std::vector< float > &descriptors, bool useProvidedKeypoints=false)'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#ad9ade269f8234b171413e4ff639a3128',1,'cv::SVD::operator()()'],['https://docs.opencv.org/4.2.0/dd/d24/classcv_1_1stereo_1_1SymetricCensus.html#a8b4e095d57a6cc44fd4997af55f2d34b',1,'cv::stereo::SymetricCensus::operator()()'],['https://docs.opencv.org/4.2.0/d7/d3e/structcv_1_1cudev_1_1tan__func.html#a2482523afd1e226cf46eca69ab6ded31',1,'cv::cudev::tan_func::operator()()'],['https://docs.opencv.org/4.2.0/db/dc4/structcv_1_1cudev_1_1tan__func_3_01double_01_4.html#abe568bfe0f6458d5f94824e3c8133869',1,'cv::cudev::tan_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d4e/structcv_1_1cudev_1_1tan__func_3_01float_01_4.html#ac7092cea3ad156fa30ff5a7aeefb1dfa',1,'cv::cudev::tan_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d9d/structcv_1_1cudev_1_1tan__func_3_01schar_01_4.html#a5d739a35f50c97b273f822c325204d24',1,'cv::cudev::tan_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dbd/structcv_1_1cudev_1_1tan__func_3_01short_01_4.html#a57af0b55d41554ecea3a1bf5ef4c7653',1,'cv::cudev::tan_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d0d/structcv_1_1cudev_1_1tan__func_3_01uchar_01_4.html#a03d6d6b2c000bd957bfa4df61f8a744f',1,'cv::cudev::tan_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d9e/structcv_1_1cudev_1_1tan__func_3_01uint_01_4.html#a6bf5488503341bbacb61b959103c7702',1,'cv::cudev::tan_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d63/structcv_1_1cudev_1_1tan__func_3_01ushort_01_4.html#a4ad3366dca634dbe0edb6b8e8e4a3739',1,'cv::cudev::tan_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1tanh__func.html#acdf93453f1d2131aecd26c37d3cfc79d',1,'cv::cudev::tanh_func::operator()()'],['https://docs.opencv.org/4.2.0/d4/d9f/structcv_1_1cudev_1_1tanh__func_3_01double_01_4.html#a58e54574cb02f13e2129204c349a8f9c',1,'cv::cudev::tanh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/dc/da0/structcv_1_1cudev_1_1tanh__func_3_01float_01_4.html#a7e21f8cf9b8d4cc3fa043fc80c3ea11c',1,'cv::cudev::tanh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d5/dfc/structcv_1_1cudev_1_1tanh__func_3_01schar_01_4.html#ab297810c17a3e1b9c39b32d71c2b6f9f',1,'cv::cudev::tanh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d8/db4/structcv_1_1cudev_1_1tanh__func_3_01short_01_4.html#a66d82124b6cfae4ab90e027781b3e366',1,'cv::cudev::tanh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d5a/structcv_1_1cudev_1_1tanh__func_3_01uchar_01_4.html#a217df735a2b55e8c29cc1877b65ffc96',1,'cv::cudev::tanh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/df/dc6/structcv_1_1cudev_1_1tanh__func_3_01uint_01_4.html#a8d6d358bc9a39244a0d829745d9b782f',1,'cv::cudev::tanh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d68/structcv_1_1cudev_1_1tanh__func_3_01ushort_01_4.html#a451a091258448763568c3148ecc90b1b',1,'cv::cudev::tanh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d09/structcv_1_1cudev_1_1TexturePtr.html#a37f533d175f7d132cfa0dbda2e9e4426',1,'cv::cudev::TexturePtr::operator()()'],['https://docs.opencv.org/4.2.0/df/df5/structcv_1_1cudev_1_1ThreshBinaryFunc.html#a52270b71a069ba892ffb1d99691466c3',1,'cv::cudev::ThreshBinaryFunc::operator()()'],['https://docs.opencv.org/4.2.0/da/d5e/structcv_1_1cudev_1_1ThreshBinaryInvFunc.html#a08286d7152097d42df33551d2459bc40',1,'cv::cudev::ThreshBinaryInvFunc::operator()()'],['https://docs.opencv.org/4.2.0/df/dd9/structcv_1_1cudev_1_1ThreshToZeroFunc.html#a5b5819f10125f84dc7ac7718b0515207',1,'cv::cudev::ThreshToZeroFunc::operator()()'],['https://docs.opencv.org/4.2.0/d8/d7e/structcv_1_1cudev_1_1ThreshToZeroInvFunc.html#a7b9e1075aefc2fbece94477f96efeab8',1,'cv::cudev::ThreshToZeroInvFunc::operator()()'],['https://docs.opencv.org/4.2.0/d0/d44/structcv_1_1cudev_1_1ThreshTruncFunc.html#a58e38cea97c6bc26b2a221b94af6b44a',1,'cv::cudev::ThreshTruncFunc::operator()()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a84b1f570775c927202a55ab1cccd9542',1,'cv::UMat::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a7679d5bea4421e360b90225d348e3fa3',1,'cv::UMat::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a0e245fe34228df0f31d3e3fdb6fa89d3',1,'cv::UMat::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#af4e69198d95654e9fe2bd03dd1feee38',1,'cv::UMat::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/d2/d83/structcv_1_1cudev_1_1UnaryNegate.html#a62a01b748a748f41e8151aa12feedd5b',1,'cv::cudev::UnaryNegate::operator()()'],['https://docs.opencv.org/4.2.0/dd/d01/structcv_1_1cudev_1_1UnaryTransformPtr.html#aeaea7fc6e3a4cebe1a5b4dbfd8aa916c',1,'cv::cudev::UnaryTransformPtr::operator()()'],['https://docs.opencv.org/4.2.0/d4/d57/structcv_1_1cudev_1_1UnaryTupleAdapter.html#ac5ef68bb68529b28058ef3728c5e8e28',1,'cv::cudev::UnaryTupleAdapter::operator()()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'cv::Vec::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'cv::Vec::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< _Tp, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< _Tp, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, 2 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, 2 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, nFeatures >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, nFeatures >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< float, 2 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< float, 2 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< float, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< float, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/da/d2c/structcv_1_1cudev_1_1WithOutMask.html#a0c1b6a4167eb490a4ccb48fd8c6fdacf',1,'cv::cudev::WithOutMask::operator()()'],['https://docs.opencv.org/4.2.0/dd/de4/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_01_4_01_4.html#a52971b170c17e2be804c1d31cb760264',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1 > >::operator()()'],['https://docs.opencv.org/4.2.0/d4/dff/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_01_4_01_4.html#a68f55e98fda4a897c29d2d4f49826f27',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2 > >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d2b/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_00_01Ptr3_01_4_01_4.html#af47fca22fa2dd342cd135d15a5015495',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2, Ptr3 > >::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html#a01fb6415bad2c6df91eb607f863fd9e5',1,'__gnu_cxx::subtractive_rng::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09463.html#a3cf37f56d2b37200d0708f75f872ada7',1,'__gnu_parallel::__accumulate_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09411.html#afba73305cf46d20618b0deb3cbd4a1ba',1,'__gnu_parallel::__adjacent_find_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09459.html#a56b55a96d25ead3f5a39c062913f7804',1,'__gnu_parallel::__count_if_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09455.html#a0e1e5ee862269d12a04fd59864f07e66',1,'__gnu_parallel::__count_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09435.html#a1e3e5bf39d889705dbb9424ac1a4fc01',1,'__gnu_parallel::__fill_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09419.html#ab86537005f7f266bbaebc18f9d44b077',1,'__gnu_parallel::__find_first_of_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09407.html#ab5c063395b4e4f3e1be257ac5327f8b2',1,'__gnu_parallel::__find_if_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09427.html#a96ab04030fc97ceace13df652312cca7',1,'__gnu_parallel::__for_each_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09431.html#aace006f0e22d008dbfbd4170ec504ff4',1,'__gnu_parallel::__generate_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09471.html#a5a619614699498f9a13f1c64d27005e6',1,'__gnu_parallel::__identity_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09467.html#aa518cf31e5b678e0ad8ed27ec50b995f',1,'__gnu_parallel::__inner_product_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09415.html#acce7eaf03f5dcb028e255f8b40ad9dfd',1,'__gnu_parallel::__mismatch_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09451.html#aac84e11aceb0e9a3a784639d4df228c3',1,'__gnu_parallel::__replace_if_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09447.html#af3f1faaa44808a57f241b03a0f9be9a5',1,'__gnu_parallel::__replace_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09439.html#a8292d668f885bee0747c9d154fb9a77e',1,'__gnu_parallel::__transform1_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09443.html#a4e0226a0b61723e0e8e716fb3a8be78f',1,'__gnu_parallel::__transform2_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09479.html#ac510e7f38f4ddc7d13db646cb65d2e25',1,'__gnu_parallel::_Nothing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09671.html#ac0da7b514eddc08518d496c93015bb39',1,'__gnu_parallel::_RandomNumber::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09671.html#a58e1450c9d06b629dde759438bc7d83c',1,'__gnu_parallel::_RandomNumber::operator()(uint64_t local_supremum)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11151.html#a01ee7eade182938e160f79cb9c68d73c',1,'__gnu_pbds::direct_mask_range_hashing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11155.html#a0b75e4a9b61ac153724d2c120d2a56dd',1,'__gnu_pbds::direct_mod_range_hashing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11143.html#a8974edcb80c2e1a8aee992a01b517b34',1,'__gnu_pbds::linear_probe_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#aba9450255401d4b96c50bf7c56d4c49a',1,'__gnu_pbds::lu_counter_policy::operator()() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#afa66044dd6264f0c6d6f1cfd05c2fe34',1,'__gnu_pbds::lu_counter_policy::operator()(metadata_reference r_data) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html#afa1064441fc28b323b7b28176686ef65',1,'__gnu_pbds::lu_move_to_front_policy::operator()() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html#a009f2dea97b29bdffa640258f86b6135',1,'__gnu_pbds::lu_move_to_front_policy::operator()(metadata_reference r_metadata) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11147.html#ae22be7552bf62d81aa93eb0b151e6016',1,'__gnu_pbds::quadratic_probe_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11783.html#aa6ced743b2988788dea80b762e85986d',1,'__gnu_pbds::sample_probe_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11787.html#aa99807ceec7e628556967db52a07bc0b',1,'__gnu_pbds::sample_range_hashing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11791.html#a0dd67bb1412f11f8898f67bb3cd1e8ec',1,'__gnu_pbds::sample_ranged_hash_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12083.html#ae4db417d4455178d78933ae2fae0c0c1',1,'__gnu_pbds::sample_trie_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#ac935e838124407bc51c0bf7c01933341',1,'__gnu_pbds::sample_update_policy::operator()() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#a6eefac672a1bb0513d6d3b145d35fd56',1,'__gnu_pbds::sample_update_policy::operator()(metadata_reference) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#a9f14ab1bc7aee93a77e4c73c37d1b9f5',1,'__gnu_pbds::tree_order_statistics_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#ac03a1d37b467c2f12926fcb78fb2803a',1,'__gnu_pbds::trie_order_statistics_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#a8366820208119a5e4179d91d09d8ea9b',1,'__gnu_pbds::trie_prefix_search_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a72dba48d3f9781e948c535e37e7eabeb',1,'gamma_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a286dd68452eebd137ec7be7852a58fca',1,'gamma_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a72dba48d3f9781e948c535e37e7eabeb',1,'gamma_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a286dd68452eebd137ec7be7852a58fca',1,'gamma_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae67f6ec56c5564a3521d734d90f35501',1,'normal_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a159f2f44c19a01c99cb937297d03604c',1,'normal_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae67f6ec56c5564a3521d734d90f35501',1,'normal_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a159f2f44c19a01c99cb937297d03604c',1,'normal_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#aec456e48e7dd746d11b2836368b7ed6d',1,'std::bernoulli_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a81e88f1000ed08018856b1b908acae12',1,'std::binomial_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#aff0946f83a897c9f8b42f88d9e6d24c6',1,'std::binomial_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#ae2c1bb8200f59e2e62b591676fffbf41',1,'std::cauchy_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a2ddd460528095405f9ee56cf681f306a',1,'std::chi_squared_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07995.html#a8ba28722822c984007c41986305ee762',1,'std::default_delete::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#ab96a2de7f6360a7fc295a0d03f0dfd2e',1,'std::discard_block_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a8213bca3ac8f3617fd3bec4f8ecd55f8',1,'std::discrete_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a11a94d907e89a229cfd4083cb8e6a14c',1,'std::exponential_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#a88eda5b7e1af374a061fdc284e8c2baa',1,'std::extreme_value_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#ab172a885f02391e497338955fbd5a5b7',1,'std::fisher_f_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#ab0bfbd15574ba442c644604dc18c4750',1,'std::function< _Res(_ArgTypes...)>::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a72dba48d3f9781e948c535e37e7eabeb',1,'std::gamma_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a286dd68452eebd137ec7be7852a58fca',1,'std::gamma_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a4a41c317cae02db9d8cc20dbbcd4d77d',1,'std::geometric_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a61bc80ca1745e63a5f22307498737844',1,'std::independent_bits_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#ae42fad7d735fb5d8d96076f70f2f65d4',1,'std::linear_congruential_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#ad9d4f2f1dd2404eeb399f7609e50f1fb',1,'std::locale::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#ae6fb96729b574441550992a32599df9a',1,'std::lognormal_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#a1c8275129594f6b1ac0830e2550698dd',1,'std::negative_binomial_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae67f6ec56c5564a3521d734d90f35501',1,'std::normal_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a159f2f44c19a01c99cb937297d03604c',1,'std::normal_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a9cd86c19e7864fe4f6e7fec1965210e9',1,'std::piecewise_constant_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a3853eb2d024be1171d980339eefb0470',1,'std::piecewise_linear_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a4ca984da5920a260845933c37d20cc2e',1,'std::poisson_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a09b00c6571fa3099f12918955723f41d',1,'std::poisson_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#af3cc39eaa42c2d1177cd98fa8e2e91e3',1,'std::shuffle_order_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a79b8f920240c03c968f96fc34b15c409',1,'std::student_t_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a7b6aa59d4719950a6014d38e1559295c',1,'std::subtract_with_carry_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a40babba47578a39b3bdc5f9b56a64268',1,'std::uniform_int_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#ae424a70312170d3b285bf6039b58cb58',1,'std::uniform_real_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a7f3883c7078a32e87c72157e91776416',1,'std::weibull_distribution::operator()()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AMDOrdering.html#afce433557abcba9e49fa81581a58fa51',1,'Eigen::AMDOrdering::operator()(const MatrixType &mat, PermutationType &perm)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AMDOrdering.html#a7f3fd7224b084f0f5655c97ea8eb6466',1,'Eigen::AMDOrdering::operator()(const SparseSelfAdjointView< SrcType, SrcUpLo > &mat, PermutationType &perm)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1COLAMDOrdering.html#a708cb20191dcd79856d922f262405946',1,'Eigen::COLAMDOrdering::operator()()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#af9fadc22d12e48c82745dad534a1671a',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::operator()(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#ab3dbba4a15d0fe90185d2900e5ef0fd1',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::operator()(Index row, Index col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#a0171eee1d9e582d1ac7ec0f18f5f615a',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::operator()(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#ae6ba07bad9e3026afe54806fdefe32bb',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::operator()(Index row, Index col)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1NaturalOrdering.html#aa39e772105ed66da9e909f2a9385be37',1,'Eigen::NaturalOrdering::operator()()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a09fce82b9bdedb5deb2b223a3d716d3f',1,'Eigen::Transform::operator()(Index row, Index col)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a9672c84cb1477eee118be144e7e5d581',1,'Eigen::Transform::operator()(Index row, Index col) const'],['https://nlohmann.github.io/json/doxygen/structstd_1_1hash_3_01nlohmann_1_1json_01_4_aec1567d1fa47dbe5b77954dce3a55b64.html#aec1567d1fa47dbe5b77954dce3a55b64',1,'std::hash< nlohmann::json >::operator()()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga68c6b644dd17b10637cf74117c44e35e',1,'operator()()(Global Namespace)']]], - ['operator_2a_324',['operator*',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a73e4a0844474b25bf254b08c7e4978d6',1,'cv::FileNodeIterator::operator*()'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a11df3b7dbaf0e16ddb430eab3b62e78f',1,'cv::LineIterator::operator*()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ad54179860880cbc148f2708c5b1fa2f6',1,'cv::MatConstIterator::operator*()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a44e02be61a20baa1ab83de13c7c956b4',1,'cv::MatConstIterator_::operator*()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac66fa81bbfc418c535a7f9f49a900554',1,'cv::MatExpr::operator*(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7f68410debc724a5be5235977b902be5',1,'cv::MatExpr::operator*(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7994c3ff3973cc56aac839dc8683ba51',1,'cv::MatExpr::operator*(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a951bede696efc7ad39b2326c257cb9b5',1,'cv::MatExpr::operator*(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae3d5b4a180f62f30b5874243af312ebb',1,'cv::MatExpr::operator*(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a54d49dc23f7a659f61ec5401b9c48d05',1,'cv::MatExpr::operator*(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaac1439d54057753cddc9330f8f56ea6',1,'cv::MatExpr::operator*(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2eb63d9f7b2d398c8714239114ff2b4e',1,'cv::MatExpr::operator*(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a31e53f019aa164af7e7276440f57f497',1,'cv::MatExpr::operator*(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69bdf2007fa634306dea2e7065f839f9',1,'cv::MatExpr::operator*(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac66fa81bbfc418c535a7f9f49a900554',1,'cv::MatExpr::operator*(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7f68410debc724a5be5235977b902be5',1,'cv::MatExpr::operator*(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7994c3ff3973cc56aac839dc8683ba51',1,'cv::MatExpr::operator*(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a951bede696efc7ad39b2326c257cb9b5',1,'cv::MatExpr::operator*(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae3d5b4a180f62f30b5874243af312ebb',1,'cv::MatExpr::operator*(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a54d49dc23f7a659f61ec5401b9c48d05',1,'cv::MatExpr::operator*(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaac1439d54057753cddc9330f8f56ea6',1,'cv::MatExpr::operator*(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2eb63d9f7b2d398c8714239114ff2b4e',1,'cv::MatExpr::operator*(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a31e53f019aa164af7e7276440f57f497',1,'cv::MatExpr::operator*(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69bdf2007fa634306dea2e7065f839f9',1,'cv::MatExpr::operator*(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a30669620dc39593b9c21b373fd83cac5',1,'cv::MatIterator_::operator*()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'cv::Matx::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'cv::Matx::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'cv::Matx::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'cv::Matx::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'cv::Matx::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'cv::Matx::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'cv::Matx::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'cv::Matx::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< _Tp, cn, 1 >::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< _Tp, cn, 1 >::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< _Tp, cn, 1 >::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< _Tp, cn, 1 >::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< _Tp, cn, 1 >::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< _Tp, cn, 1 >::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 1, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 1, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 1, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 1, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 1, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 1, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 2 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 2 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 2 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 2 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 2 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 2 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 4, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 4, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 4, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 4, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 4, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 4, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, cn, 1 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, cn, 1 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, cn, 1 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, cn, 1 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, cn, 1 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, cn, 1 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 2, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 2, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 2, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 2, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 2, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 2, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 3, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 3, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 3, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 3, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 3, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 3, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, cn, 1 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, cn, 1 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, cn, 1 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, cn, 1 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, cn, 1 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, cn, 1 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float_type, 4, 4 >::operator*(int alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float_type, 4, 4 >::operator*(float alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float_type, 4, 4 >::operator*(double alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, l > &a, const Matx< float_type, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, const Vec< float_type, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float_type, 4, 4 >::operator*(int alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float_type, 4, 4 >::operator*(float alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float_type, 4, 4 >::operator*(double alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, l > &a, const Matx< float_type, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, const Vec< float_type, n > &b)'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a603a8a1c3cc866977c8fbd8b55314c86',1,'cv::MatxCommaInitializer::operator*()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a603a8a1c3cc866977c8fbd8b55314c86',1,'MatxCommaInitializer< _Tp, m, 1 >::operator*()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a98a3906afc1a4005f761124f3fd22e8e',1,'cv::util::optional::operator*()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a37e1e46df264e1fddf325db1e6903c5b',1,'cv::util::optional::operator*() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac2116f5bce2914d578953c6ac8c0da16',1,'cv::softdouble::operator*()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab2ccc99b90013df8b9cf49f6c63842ff',1,'cv::softfloat::operator*()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a1db341e36da96bff57ce3c8d16aa85a2',1,'cv::SparseMatConstIterator_::operator*()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a26262be0fb6504badd2d515e7dbbd648',1,'cv::SparseMatIterator_::operator*()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'cv::Vec::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'cv::Vec::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'cv::Vec::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'cv::Vec::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'cv::Vec::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'cv::Vec::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'cv::Vec::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'cv::Vec::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< _Tp, 4 >::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< _Tp, 4 >::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< _Tp, 4 >::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< _Tp, 4 >::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< _Tp, 4 >::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< _Tp, 4 >::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 2 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 2 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 2 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 2 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 2 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 2 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 2 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 2 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 3 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 3 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 3 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 3 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 3 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 3 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 3 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 3 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 4 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 4 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 4 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 4 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 4 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 4 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 4 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 4 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 2 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 2 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 2 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 2 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 2 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 2 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 2 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 2 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 3 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 3 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 3 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 3 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 3 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 3 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 3 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 3 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d1/d3e/classcv_1_1VecCommaInitializer.html#a43e67fe37475c2c6e7081285cb7a8f56',1,'cv::VecCommaInitializer::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a09753efe38fc494639cbbe005409fe51',1,'__gnu_debug::_Safe_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a8e237d9370458e65ea6141b677e8e8f8',1,'__gnu_debug::_Safe_local_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#a89e62967a92648f52f3da16144bf9b75',1,'__gnu_parallel::_GuardedIterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#aeebd8eab002abaceeeeedbb0850ae617',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11631.html#aab710c87290d148b6dd2eb260ff27a1d',1,'__gnu_pbds::detail::bin_search_tree_node_it_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a50d89bdcb26164ff380a312673cf0f06',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a50d89bdcb26164ff380a312673cf0f06',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a60ad369139de2b800a5a729f10b992bb',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a60ad369139de2b800a5a729f10b992bb',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11867.html#a89338f1c18b5234bf80ef61c8f839359',1,'__gnu_pbds::detail::ov_tree_node_it_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a951a43bd97e277ad638e8cf8229d0af3',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11951.html#a575ff0f4d10725779405d8e83dc27463',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a09753efe38fc494639cbbe005409fe51',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a09753efe38fc494639cbbe005409fe51',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#aa36fe65e861c9fe0e67b77f28d0fea0b',1,'const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a44f292f812c56ddf38a1cded7175fa22',1,'iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#aa36fe65e861c9fe0e67b77f28d0fea0b',1,'point_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a07f5dff121401de22bbc2647de595243',1,'point_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a2e044fd0c71fba38157d3aa588be4518',1,'std::auto_ptr::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#a07c1b7a9f42341013f7a44752596d16e',1,'std::back_insert_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#a1686a970fd21798542dd32e3c2208b95',1,'std::front_insert_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a1a406c868feb4c886b002870abeb8546',1,'std::insert_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#aa68118742e48a3296a39611184764153',1,'std::istreambuf_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#a179357ce2cd1d4a53d9c0e5efb65e4df',1,'std::ostreambuf_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a89ee258fe95b81e17fb0eaf4cb0fd565',1,'std::regex_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a0ae03837c2bb4c283a500b70e00743bd',1,'std::regex_token_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a7af5d174f9cb1016e5028e6a8716753b',1,'std::reverse_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'std::unique_ptr::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Codecvt >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Res_type >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Result< _Res > >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Result_base >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< bool[]>::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#ad0a428546d0ff7ed06cca4c4a1e4522a',1,'Eigen::AngleAxis::operator*(const AngleAxis &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a36fa315e0326beacbf249b56fcd0596e',1,'Eigen::AngleAxis::operator*(const QuaternionType &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#acdec7200dd68b70b615bcda9659fed26',1,'Eigen::AngleAxis::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ac57e5a22f1646e04a4f8b4cba3825928',1,'Eigen::HouseholderSequence::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html#ada8389f291839964d7b481464f0e4e94',1,'Eigen::JacobiRotation::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a36fb95c37f0a454e0e2e5cb120b2df7f',1,'Eigen::MatrixBase::operator*(const DiagonalBase< DiagonalDerived > &diagonal) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae2d220efbf7047f0894787888288cfcc',1,'Eigen::MatrixBase::operator*(const MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a36fb95c37f0a454e0e2e5cb120b2df7f',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator*(const DiagonalBase< DiagonalDerived > &diagonal) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae2d220efbf7047f0894787888288cfcc',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator*(const MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a36fb95c37f0a454e0e2e5cb120b2df7f',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator*(const DiagonalBase< DiagonalDerived > &diagonal) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae2d220efbf7047f0894787888288cfcc',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator*(const MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'Eigen::PermutationBase::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'Eigen::PermutationBase::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a3f404810659d5095a6db906a4728ddfb',1,'Eigen::PermutationBase::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a3f404810659d5095a6db906a4728ddfb',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a3f404810659d5095a6db906a4728ddfb',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a3f404810659d5095a6db906a4728ddfb',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a3f404810659d5095a6db906a4728ddfb',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'Eigen::QuaternionBase::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#adbfbf2d1ccdf50999bad7688348f4ac2',1,'Eigen::Rotation2D::operator*(const Rotation2D &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ad0ad69c781232313b7d01f981148f230',1,'Eigen::Rotation2D::operator*(const Vector2 &vec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'Eigen::RotationBase::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'Eigen::RotationBase::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'Eigen::RotationBase::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'Eigen::RotationBase::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'Eigen::RotationBase::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'Eigen::RotationBase::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Derived, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Derived, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Derived, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Derived, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'RotationBase< Derived, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'RotationBase< Derived, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af18c39fdc7783c63766ba22ce0e784c3',1,'Eigen::SelfAdjointView::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a2fb955589b841c308dc875e3ab3193e8',1,'Eigen::SelfAdjointView::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af18c39fdc7783c63766ba22ce0e784c3',1,'SelfAdjointView< const Derived, UpLo >::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a2fb955589b841c308dc875e3ab3193e8',1,'SelfAdjointView< const Derived, UpLo >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'Eigen::SparseMatrixBase::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< Transpose< MatrixType > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a887e3b5fa468af8413276141ddc8bb93',1,'Eigen::SparseSelfAdjointView::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a9d1e5ef26775e3b43be08fd4ae191aa8',1,'Eigen::SparseSelfAdjointView::operator*(const SparseMatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a346ad7b3c5c8769c0fe29ae9e921b429',1,'Eigen::SparseSelfAdjointView::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a9bbe41a5c050f8067d4fe77372eb0b7a',1,'Eigen::SparseSelfAdjointView::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a887e3b5fa468af8413276141ddc8bb93',1,'SparseSelfAdjointView< const Derived, UpLo >::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a9d1e5ef26775e3b43be08fd4ae191aa8',1,'SparseSelfAdjointView< const Derived, UpLo >::operator*(const SparseMatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a346ad7b3c5c8769c0fe29ae9e921b429',1,'SparseSelfAdjointView< const Derived, UpLo >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a9bbe41a5c050f8067d4fe77372eb0b7a',1,'SparseSelfAdjointView< const Derived, UpLo >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ab3d93a2aba9d06e7d134798f92617da7',1,'Eigen::Transform::operator*(const DiagonalBase< DiagonalDerived > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a257ab8b9141982bd6f56771ba822526f',1,'Eigen::Transform::operator*(const EigenBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a7e75d983600d35b603f740a3a28bbc6c',1,'Eigen::Transform::operator*(const Transform &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ad4fc26aef2abfb9fdadb7d64aaf58c31',1,'Eigen::Transform::operator*(const Transform< Scalar, Dim, OtherMode, OtherOptions > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a8941cc25b120ff7ee7b435150ba699b3',1,'Eigen::Transform::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a090b3d825f52110533fbea6d0d127ea0',1,'Eigen::Transform::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a2289ae59c8f871d9d9c73ba7eeb035f8',1,'Eigen::Translation::operator*(const EigenBase< OtherDerived > &linear) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a62a95caa45e0aa178e0b2759c78874b1',1,'Eigen::Translation::operator*(const MatrixBase< Derived > &vec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a37840d7fa515418e143593efbd21c6b3',1,'Eigen::Translation::operator*(const RotationBase< Derived, Dim > &r) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#ac0e625c8d90f899be9c73b77592a003f',1,'Eigen::Translation::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#aa79f1217e27556e0524260e172a0b081',1,'Eigen::Translation::operator*(const Translation &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a156c8003ff3830756727e805cf98c0ab',1,'Eigen::Translation::operator*(const UniformScaling< Scalar > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a918cdd281bce3363e0e242b22bccbbec',1,'Eigen::Translation::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#ad21c964c4d5dff8aa496558ef74731f1',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#aea3c3ed2813ff9e48adc14fa7bbd9360',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a8abd57298d10bd620bdfc459d22e8add',1,'Eigen::UniformScaling::operator*(const MatrixBase< Derived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#ad8c9401526e9ade727036b6d255fbdc0',1,'Eigen::UniformScaling::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a19c405341f2c861eb0ddfc4f760fecf8',1,'Eigen::UniformScaling::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#af3044cffe5703a1946c33a953b0f9bb6',1,'Eigen::UniformScaling::operator*(const UniformScaling &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a8f79e131479dbe709ee1173b1be9a8f0',1,'Eigen::UniformScaling::operator*(const MatrixBase< Derived > &matrix, const UniformScaling< Scalar > &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'Eigen::VectorwiseOp::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Derived, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Derived, Vertical >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator*()'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gac57f9a35a5d4d1d3ba23d7871113cbd3',1,'cv::operator*(const Affine3< T > &affine1, const Affine3< T > &affine2)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gae9c102e6fd783bcf801e3432aca22e7b',1,'cv::operator*(const Affine3< T > &affine, const V &vector)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga548eb6a25623179405f13cad3954c01e',1,'cv::operator*(const Affine3f &affine, const Vec3f &vector)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaa607fd3c66c5c525cc4d39dc83ffd177',1,'cv::operator*(const Affine3d &affine, const Vec3d &vector)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga902a09c161f9ef0eedcf1414e58f3672',1,'cv::operator*(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487b453f9836d06d7324744d40dad0b',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6515905db0f226f4645878f458e4ff9',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf583d2c1fcd51d86094e1f30b2a58a2',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e1bad5a79815eec73d07827b885d1cd',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f79b898d0d82738072b4c49ef4086',1,'cv::cudev::operator*(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5a0a9a53dee95c42e80578e6440b218',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf27cecd7f8e200f4de479660583a8d15',1,'cv::cudev::operator*(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7f8cfe1eaafe131a814ee152b9a6e5a',1,'cv::cudev::operator*(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12aeb64e97cdb928290bf3fa82f05269',1,'cv::cudev::operator*(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fa7f2aa7dd5048da167a76587a44028',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93118d92ecb3c188a5c01ba769ba299e',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1a615302d17eda49ad2cec76c41859',1,'cv::cudev::operator*(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca535315088057b26c801a5705c1483',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510f2b0f9088282d3d47bf3093a38f78',1,'cv::cudev::operator*(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga163edd6ad357b0a6b49d3ad55b84f88c',1,'cv::cudev::operator*(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c75809716911fce2e047b0fb0c984b',1,'cv::cudev::operator*(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9db0eb6fb6dacf76ef4e8c8c304ddd9c',1,'cv::cudev::operator*(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b5811bca4633d9a78a6cae2adfa3dff',1,'cv::cudev::operator*(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafda944b16459e9a69661d33e7607fb41',1,'cv::cudev::operator*(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c7c955caf1909eb3c94363e1c7d3cb5',1,'cv::cudev::operator*(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4aaeb25bb41c3e4d44a51b4930532426',1,'cv::cudev::operator*(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43ee6bae7bda7ed2faf47b555790cb71',1,'cv::cudev::operator*(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02baabd5114aa4d102ed246afc6ce624',1,'cv::cudev::operator*(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga090d742c550d7e79878be81be9bdb2d2',1,'cv::cudev::operator*(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18a1ba838a8be508e64a43158cc45dfb',1,'cv::cudev::operator*(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e14d050010ca7c994471bf8467e32d3',1,'cv::cudev::operator*(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d7b1523f9c29c8a05ad2e41f191a2fe',1,'cv::cudev::operator*(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa1246b30b73eb70bba00a86fcd66395',1,'cv::cudev::operator*(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba88bd93ccad1c92db994fe051e342b',1,'cv::cudev::operator*(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98f94ba39b97b682e67464d85209e95',1,'cv::cudev::operator*(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84372ff1d3b6a2526b19964595096039',1,'cv::cudev::operator*(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3cc2c07d0405e5bef08000f75eb39e8',1,'cv::cudev::operator*(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c697c1a0f04f6e63a5f9da4ac327e85',1,'cv::cudev::operator*(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc87fb00c079b8edcfccd10ab13af8d2',1,'cv::cudev::operator*(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf59a024579c49c38a26a8a27e58297c1',1,'cv::cudev::operator*(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf912af0788d82a8d5aff820aaa99059',1,'cv::cudev::operator*(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88c3308c7efb95649564d8be2691284d',1,'cv::cudev::operator*(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb953af5f4125ba0182c6f8917300f90',1,'cv::cudev::operator*(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac65246dd4280d78429ab84b3fc9c2870',1,'cv::cudev::operator*(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f3e6aea5eb84905c559ef24412fa56',1,'cv::cudev::operator*(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga414e54087adc42f28fa754230dbab979',1,'cv::cudev::operator*(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac2d56a48c008a7e47b6310b109b376e',1,'cv::cudev::operator*(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d7b82717c159efcaadead58ee8142a8',1,'cv::cudev::operator*(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe5bfda78209600b7280b4bbd3cc3762',1,'cv::cudev::operator*(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae528d51efc3d013a608832c80bed2f8c',1,'cv::cudev::operator*(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga849d54a360b19427092bd7ce395da7c5',1,'cv::cudev::operator*(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f187e66cff592d0712ceaaa605e038',1,'cv::cudev::operator*(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac0afe2a5142d8098d2482c3814f8671',1,'cv::cudev::operator*(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5a08e2ac528655b1571f7fcb28c3c0',1,'cv::cudev::operator*(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5333891f8e975c6bc4e8f5813545b4b',1,'cv::cudev::operator*(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a3078c6a237576551f2d32606e32f10',1,'cv::cudev::operator*(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed7245cd9d9405b2de08c4b21fa08a5',1,'cv::cudev::operator*(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc381907b598468405b30d25a06c8ff',1,'cv::cudev::operator*(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e97c44127431ce49735fa92dbe4b25f',1,'cv::cudev::operator*(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9424ca0c0b214254e9adecb61adb2e5a',1,'cv::cudev::operator*(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae410ccbe1a6a58649302ccebf3c68949',1,'cv::cudev::operator*(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3b2a2d0d9a613d056c8523e155b674c',1,'cv::cudev::operator*(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85f5cd22ec760e4a2c14c78d80f4670d',1,'cv::cudev::operator*(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37e9268a08593a1e1bb839e2ce50ede9',1,'cv::cudev::operator*(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2429e2ed1796030785a93567ecf1776f',1,'cv::cudev::operator*(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1c28bd26127b812ce97c907b32fc9fc',1,'cv::cudev::operator*(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9cc4a289ee92829765bdf1958bc6e05',1,'cv::cudev::operator*(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e8f6dbe9d17cbd6cf04375fc5fca9ae',1,'cv::cudev::operator*(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f2fa27b61586fef88ab71db6e08faf0',1,'cv::cudev::operator*(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf9988841348e5856a943b777002e2b',1,'cv::cudev::operator*(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b8a526c1994b95e9ce76e3614acc86',1,'cv::cudev::operator*(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23920ad7c06382a913e3fcf217459a0b',1,'cv::cudev::operator*(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e9ba42884866db4b183e9028fd8b04f',1,'cv::cudev::operator*(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf5b25603db42e2eb11c8fdd17a7f25f',1,'cv::cudev::operator*(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c10d68845ebb0598810e51a2eba805c',1,'cv::cudev::operator*(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65f2d1823549a4b6dc52ef6d3054ba56',1,'cv::cudev::operator*(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1f3d4142ff834d438ef16a84fb23355',1,'cv::cudev::operator*(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fcd3e4a9f5ffcb684e3945e713a190f',1,'cv::cudev::operator*(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3caace9001357c38394f006fb1f634a',1,'cv::cudev::operator*(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2076958e894ca52570151a2308d8c781',1,'cv::cudev::operator*(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2741381920372f76817c4b9b76e28137',1,'cv::cudev::operator*(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2394ee2867506f375e14a36018519d8a',1,'cv::cudev::operator*(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6028638b717b193d90a9bbdd76a2797',1,'cv::cudev::operator*(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf250948634b71efc0820d731faa6cda1',1,'cv::cudev::operator*(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc861ca7430feace92266e538ed54b24',1,'cv::cudev::operator*(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08650b887f60c9a6c242c79f09c0cb69',1,'cv::cudev::operator*(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5522c68d2ae330209abc2765d6b50992',1,'cv::cudev::operator*(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacef4b96ed094bbed58d13a7071d1a87a',1,'cv::cudev::operator*(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5bd92d93ed5dbf9714a033550a83ed',1,'cv::cudev::operator*(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac18603d03fbcfdfd23751709f2238029',1,'cv::cudev::operator*(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5afec7fb5b0492668e86c8181f441aa',1,'cv::cudev::operator*(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2943f13db2702fddce4557a2e957c565',1,'cv::cudev::operator*(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32454c9d98afba5f7144a92cd6bf5acb',1,'cv::cudev::operator*(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16a1d022b4026918e85eaf28ac606a81',1,'cv::cudev::operator*(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8c6dcb676ea367c9e1dd89fd4f0abf4',1,'cv::cudev::operator*(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27de604fa033669bc0555199b31ef777',1,'cv::cudev::operator*(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1edec141c59b8a684d2592d1420949a1',1,'cv::cudev::operator*(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07a0d9f472b1baec9f5eabfff9d1eaf7',1,'cv::cudev::operator*(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6be4a7723c490f8b150c714436100e12',1,'cv::cudev::operator*(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddd96b00b4b034d26ce474707a4e5e1d',1,'cv::cudev::operator*(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7ef727c5051a2421616f0517740d984',1,'cv::cudev::operator*(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11b210a1793cf8e3d930c11dfda9ae6e',1,'cv::cudev::operator*(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55db9f51fac5b573deb32220a631ca9',1,'cv::cudev::operator*(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28a4888db08301e51da23d006f382653',1,'cv::cudev::operator*(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7020c56e082be84fca69fa2c9916a4e',1,'cv::cudev::operator*(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c25ca47380b7997200bb81a88f0323',1,'cv::cudev::operator*(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7b92c373c28a5c4e44617cbbe8b28d8',1,'cv::cudev::operator*(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dff9b27265d9a0d0b246618c2f6d190',1,'cv::cudev::operator*(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e7e1c4649f286432072ebf0bbcaa069',1,'cv::cudev::operator*(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98148cbe18fa5a1fe9cc37af9b2944da',1,'cv::cudev::operator*(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8af39ddbfd14cda64dc1ea8312ddeaab',1,'cv::cudev::operator*(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25a1baeb7c9b07639b599dcafb0a7dd1',1,'cv::cudev::operator*(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cfca580e4aed7f30b018f5b3b5f04de',1,'cv::cudev::operator*(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28a09636e8ddc34502754ef3cc45736',1,'cv::cudev::operator*(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd4d86a80e9a8ba4d0b8191946a7c7e4',1,'cv::cudev::operator*(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga500f12286f4bde3313357ee9b77522d8',1,'cv::cudev::operator*(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b1789f57a51f5db4560fe91f26bbd1',1,'cv::cudev::operator*(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5723f7cf916b1c9455c8581abcdeb505',1,'cv::cudev::operator*(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0e897f09e26316ca2aa0cbb965e1835',1,'cv::cudev::operator*(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga314f5a0e14f5b478c6c979776c26d203',1,'cv::cudev::operator*(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819a0d444655998d3ae70cd93b283319',1,'cv::cudev::operator*(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a5340751b48d6b199875c361804465',1,'cv::cudev::operator*(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bce5ffd4058a6549f3bb651f50bfe46',1,'cv::cudev::operator*(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ca0ada3b453db74593720374e9af90f',1,'cv::cudev::operator*(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2228f02f69514b9ea9c3bd30df71d0',1,'cv::cudev::operator*(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f24178f4139fa88be47e2b9f7126eb',1,'cv::cudev::operator*(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82ad067165475e005f75eb902cbcf2f6',1,'cv::cudev::operator*(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eca4d9d17555bb68127757943e54495',1,'cv::cudev::operator*(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddaa9f9bc413848a741a108556de7f66',1,'cv::cudev::operator*(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d937bc5dd036bbbc645b81f260b5b5',1,'cv::cudev::operator*(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3cce3391058528e77d01b2f2aaf28f4',1,'cv::cudev::operator*(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd32b6bf1571865c29d46f1ac091c5d',1,'cv::cudev::operator*(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09b06dc7f40394668ea338909fdb11da',1,'cv::cudev::operator*(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2561dcb50f1b343e79d929c85d9d6af2',1,'cv::cudev::operator*(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab96739276183d3d037db1b31b54f98cb',1,'cv::cudev::operator*(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bc8a2714623a07f6d32a01c5a02a19d',1,'cv::cudev::operator*(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e546e55ec80d5ce6e41dd72c8091ad7',1,'cv::cudev::operator*(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0f13827bf653baef99ce65166394e7f',1,'cv::cudev::operator*(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19620047188467d968634de432862b30',1,'cv::cudev::operator*(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9f8c286132b32a1d0d2f136b9304e9f',1,'cv::cudev::operator*(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89bebd81801426221358914f44b9399f',1,'cv::cudev::operator*(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad909b1577d5bc471b8ebc7d934253736',1,'cv::cudev::operator*(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ddea16553b01373469d460fd8f5f9',1,'cv::cudev::operator*(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd372b32bcd38be3dd4261d657c742fa',1,'cv::cudev::operator*(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e03853be024cf4a58640b575d7b6122',1,'cv::cudev::operator*(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b0ea30f8320cf30ca3b42aa699e1d11',1,'cv::cudev::operator*(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4976047aad73ae11f14d5311b5efc643',1,'cv::cudev::operator*(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d268df51117be47d5a192550113b2bb',1,'cv::cudev::operator*(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga886827c0f13b44c8fa578f3d4bab6187',1,'cv::cudev::operator*(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06546a623ef3a0292e0d0b5b9a241596',1,'cv::cudev::operator*(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f215d83712628eb64664ca8edc729c3',1,'cv::cudev::operator*(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322e5725d39b6a56b10217744fd54c84',1,'cv::cudev::operator*(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ca17de0407d90a3cac404220b157d5',1,'cv::cudev::operator*(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac169dc02de88236dc3287630549e7c32',1,'cv::cudev::operator*(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d60d4ea2cc22ce5ae0cf0950b2148dd',1,'cv::cudev::operator*(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95b4ecd54e292812be0faf0a93687fa5',1,'cv::cudev::operator*(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9246aa07ab9cb8d3a42db71f45d804a',1,'cv::cudev::operator*(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed19b40b852d4b05f7af20906f02df96',1,'cv::cudev::operator*(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa8c599bd31954a5687b8a1ae2ba1696',1,'cv::cudev::operator*(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ea6d03ee2c62f728d3fbfe71f16b259',1,'cv::cudev::operator*(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dabe0e00519ed1f069e7682e7dc28d2',1,'cv::cudev::operator*(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga916d16970792f1444932d3551460e762',1,'cv::cudev::operator*(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0acc20bf74d011ff6eb0263efa31c91',1,'cv::cudev::operator*(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacea516a696d7e15b81d71bc335a1be2b',1,'cv::cudev::operator*(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67e2f781ad85fbc5b4b2759018ef0bc',1,'cv::cudev::operator*(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cee4b43501cb0d54db315a9be3c00be',1,'cv::cudev::operator*(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eb8ba99e7883f7e5208da1d56a63ea8',1,'cv::cudev::operator*(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd127c751ea3d9b32c47a50503405eaa',1,'cv::cudev::operator*(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea8d0ec3ad321a074118524061e9de9b',1,'cv::cudev::operator*(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae972a64880e7f11f0b512bf4862c988d',1,'cv::cudev::operator*(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae7124c60811e471f4ccea775e6a8105',1,'cv::cudev::operator*(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefcfe41bdbb40358a627620664e43087',1,'cv::cudev::operator*(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga532206b6078098de41bdb7cdee843242',1,'cv::cudev::operator*(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6dde37f01013af843248fa57df5a4705',1,'cv::cudev::operator*(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d83c6f1c934d58b0db96fb9b1031e4',1,'cv::cudev::operator*(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0555787fcd7d58a8c94d0a4369c947',1,'cv::cudev::operator*(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5305d06b4d7893f8d4fb352f6941d49',1,'cv::cudev::operator*(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbccb0f7cfedd9faa5375d17e7acd9e6',1,'cv::cudev::operator*(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d713228fed5e4b46d913ee514c4702',1,'cv::cudev::operator*(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga416c75338bba0071cde9be85bdd14c8f',1,'cv::cudev::operator*(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c4bf653481daa71869c6ec80f7ac7c',1,'cv::cudev::operator*(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62bf09c0d8b2a28f9de71abb998ab55f',1,'cv::cudev::operator*(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e873b6129892d4d634e0b541aa5a356',1,'cv::cudev::operator*(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db9280a8455e340346203f8c8dbc45d',1,'cv::cudev::operator*(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bfdc89f82d9717003387c1d237f5923',1,'cv::cudev::operator*(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f86fba4880a36b6a7bd2394e161b34',1,'cv::cudev::operator*(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f952a21290dc2760de145e020239a6',1,'cv::cudev::operator*(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga530e3a25447a5113790059cf574c9d4d',1,'cv::cudev::operator*(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga939ac4107ae2ef44cdba119f11a3e41b',1,'cv::cudev::operator*(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa226675e3d5fa565377951e1fe2adf26',1,'cv::cudev::operator*(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga032a606b459e22962751c5b5cb56721c',1,'cv::cudev::operator*(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42182588882947c6d2ea60418ccfa53f',1,'cv::cudev::operator*(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657fd69c2c2dbaa5bbd8f38e9086600c',1,'cv::cudev::operator*(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga913025bdda9cfaf0a1d39fe6f912d32e',1,'cv::cudev::operator*(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcfcf7d4b858ae3c794028e7c55b20a',1,'cv::cudev::operator*(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b854a847e119bfbc02c2cc5de31787',1,'cv::cudev::operator*(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb615b962e904782d9555a089708366d',1,'cv::cudev::operator*(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b093cf980d6cabad1afbc4954ce86f9',1,'cv::cudev::operator*(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0613453550f4199c8fe8734f2e7ef4cb',1,'cv::cudev::operator*(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb4e9c2226edb173d19a520c69297f57',1,'cv::cudev::operator*(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a441729d11f327aa925f6980920c810',1,'cv::cudev::operator*(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c93c9c99656ffb2dcd5abda39efae1d',1,'cv::cudev::operator*(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b2fee3c015fbd9323b9951b595639f0',1,'cv::cudev::operator*(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1881d24ddb09d043dcd7c859e61b16',1,'cv::cudev::operator*(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c0fa10b8bed67d42ab55dc2208107f8',1,'cv::cudev::operator*(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga027915df6e568365ecfa3e12a5e677f4',1,'cv::cudev::operator*(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58bcfcef533a71a0a1a9ee50738d257c',1,'cv::cudev::operator*(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5920528b65944ed40e4497447d8e0316',1,'cv::cudev::operator*(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44418d16b815d5057b17b2a34246734c',1,'cv::cudev::operator*(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d29745317c743241a4d85cedc91bf88',1,'cv::cudev::operator*(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cbf71951b93eea0b5a076f7d18a7451',1,'cv::cudev::operator*(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e048d5a2db1da9b1575aebd01b047bb',1,'cv::cudev::operator*(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga663d40c6e2002f25c436d52d82b2c690',1,'cv::cudev::operator*(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7bd29f68c70d0a3b1b705f889140d0e',1,'cv::cudev::operator*(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4030fb67021c4472688f397dc551adb',1,'cv::cudev::operator*(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3476d190ac862ed33f50e5178938f6a',1,'cv::cudev::operator*(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04af26fcf72bcf1ea89a3406eb81dc56',1,'cv::cudev::operator*(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01861575c1321bb4e37ba4ff91b8f7dc',1,'cv::cudev::operator*(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9601e46278afcfaa677985f801a57d76',1,'cv::cudev::operator*(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab805b6e07f01115a8e08afa3108525',1,'cv::cudev::operator*(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a3751f548f681546118362181963dae',1,'cv::cudev::operator*(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8075bb13162203e07a2b9276b42aa063',1,'cv::cudev::operator*(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f7ee241d6ee1a6a20c735286770c6f',1,'cv::cudev::operator*(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga789c8bfcf46261d2c0c69901bfc53c61',1,'cv::cudev::operator*(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33a577374fa11cf0c7d9debceed5d70b',1,'cv::cudev::operator*(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab14d1e659db18b0c671ca9dbf9e0048f',1,'cv::cudev::operator*(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfad4cd4b1abf7ed115e9261d4fafaf1',1,'cv::cudev::operator*(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95434e47c47ea25a3a6d9f1906258286',1,'cv::cudev::operator*(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66aff7a10720233331180655c8be700d',1,'cv::cudev::operator*(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gac57f9a35a5d4d1d3ba23d7871113cbd3',1,'operator*(const Affine3< T > &affine1, const Affine3< T > &affine2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gae9c102e6fd783bcf801e3432aca22e7b',1,'operator*(const Affine3< T > &affine, const V &vector)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga548eb6a25623179405f13cad3954c01e',1,'operator*(const Affine3f &affine, const Vec3f &vector)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaa607fd3c66c5c525cc4d39dc83ffd177',1,'operator*(const Affine3d &affine, const Vec3d &vector)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab2ccc99b90013df8b9cf49f6c63842ff',1,'operator*(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac2116f5bce2914d578953c6ac8c0da16',1,'operator*(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga902a09c161f9ef0eedcf1414e58f3672',1,'operator*(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487b453f9836d06d7324744d40dad0b',1,'operator*(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6515905db0f226f4645878f458e4ff9',1,'operator*(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf583d2c1fcd51d86094e1f30b2a58a2',1,'operator*(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e1bad5a79815eec73d07827b885d1cd',1,'operator*(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f79b898d0d82738072b4c49ef4086',1,'operator*(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5a0a9a53dee95c42e80578e6440b218',1,'operator*(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf27cecd7f8e200f4de479660583a8d15',1,'operator*(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7f8cfe1eaafe131a814ee152b9a6e5a',1,'operator*(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12aeb64e97cdb928290bf3fa82f05269',1,'operator*(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fa7f2aa7dd5048da167a76587a44028',1,'operator*(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93118d92ecb3c188a5c01ba769ba299e',1,'operator*(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1a615302d17eda49ad2cec76c41859',1,'operator*(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca535315088057b26c801a5705c1483',1,'operator*(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510f2b0f9088282d3d47bf3093a38f78',1,'operator*(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga163edd6ad357b0a6b49d3ad55b84f88c',1,'operator*(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c75809716911fce2e047b0fb0c984b',1,'operator*(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9db0eb6fb6dacf76ef4e8c8c304ddd9c',1,'operator*(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b5811bca4633d9a78a6cae2adfa3dff',1,'operator*(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafda944b16459e9a69661d33e7607fb41',1,'operator*(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c7c955caf1909eb3c94363e1c7d3cb5',1,'operator*(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4aaeb25bb41c3e4d44a51b4930532426',1,'operator*(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43ee6bae7bda7ed2faf47b555790cb71',1,'operator*(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02baabd5114aa4d102ed246afc6ce624',1,'operator*(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga090d742c550d7e79878be81be9bdb2d2',1,'operator*(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18a1ba838a8be508e64a43158cc45dfb',1,'operator*(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e14d050010ca7c994471bf8467e32d3',1,'operator*(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d7b1523f9c29c8a05ad2e41f191a2fe',1,'operator*(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa1246b30b73eb70bba00a86fcd66395',1,'operator*(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba88bd93ccad1c92db994fe051e342b',1,'operator*(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98f94ba39b97b682e67464d85209e95',1,'operator*(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84372ff1d3b6a2526b19964595096039',1,'operator*(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3cc2c07d0405e5bef08000f75eb39e8',1,'operator*(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c697c1a0f04f6e63a5f9da4ac327e85',1,'operator*(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc87fb00c079b8edcfccd10ab13af8d2',1,'operator*(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf59a024579c49c38a26a8a27e58297c1',1,'operator*(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf912af0788d82a8d5aff820aaa99059',1,'operator*(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88c3308c7efb95649564d8be2691284d',1,'operator*(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb953af5f4125ba0182c6f8917300f90',1,'operator*(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac65246dd4280d78429ab84b3fc9c2870',1,'operator*(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f3e6aea5eb84905c559ef24412fa56',1,'operator*(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga414e54087adc42f28fa754230dbab979',1,'operator*(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac2d56a48c008a7e47b6310b109b376e',1,'operator*(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d7b82717c159efcaadead58ee8142a8',1,'operator*(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe5bfda78209600b7280b4bbd3cc3762',1,'operator*(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae528d51efc3d013a608832c80bed2f8c',1,'operator*(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga849d54a360b19427092bd7ce395da7c5',1,'operator*(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f187e66cff592d0712ceaaa605e038',1,'operator*(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac0afe2a5142d8098d2482c3814f8671',1,'operator*(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5a08e2ac528655b1571f7fcb28c3c0',1,'operator*(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5333891f8e975c6bc4e8f5813545b4b',1,'operator*(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a3078c6a237576551f2d32606e32f10',1,'operator*(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed7245cd9d9405b2de08c4b21fa08a5',1,'operator*(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc381907b598468405b30d25a06c8ff',1,'operator*(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e97c44127431ce49735fa92dbe4b25f',1,'operator*(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9424ca0c0b214254e9adecb61adb2e5a',1,'operator*(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae410ccbe1a6a58649302ccebf3c68949',1,'operator*(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3b2a2d0d9a613d056c8523e155b674c',1,'operator*(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85f5cd22ec760e4a2c14c78d80f4670d',1,'operator*(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37e9268a08593a1e1bb839e2ce50ede9',1,'operator*(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2429e2ed1796030785a93567ecf1776f',1,'operator*(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1c28bd26127b812ce97c907b32fc9fc',1,'operator*(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9cc4a289ee92829765bdf1958bc6e05',1,'operator*(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e8f6dbe9d17cbd6cf04375fc5fca9ae',1,'operator*(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f2fa27b61586fef88ab71db6e08faf0',1,'operator*(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf9988841348e5856a943b777002e2b',1,'operator*(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b8a526c1994b95e9ce76e3614acc86',1,'operator*(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23920ad7c06382a913e3fcf217459a0b',1,'operator*(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e9ba42884866db4b183e9028fd8b04f',1,'operator*(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf5b25603db42e2eb11c8fdd17a7f25f',1,'operator*(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c10d68845ebb0598810e51a2eba805c',1,'operator*(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65f2d1823549a4b6dc52ef6d3054ba56',1,'operator*(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1f3d4142ff834d438ef16a84fb23355',1,'operator*(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fcd3e4a9f5ffcb684e3945e713a190f',1,'operator*(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3caace9001357c38394f006fb1f634a',1,'operator*(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2076958e894ca52570151a2308d8c781',1,'operator*(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2741381920372f76817c4b9b76e28137',1,'operator*(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2394ee2867506f375e14a36018519d8a',1,'operator*(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6028638b717b193d90a9bbdd76a2797',1,'operator*(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf250948634b71efc0820d731faa6cda1',1,'operator*(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc861ca7430feace92266e538ed54b24',1,'operator*(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08650b887f60c9a6c242c79f09c0cb69',1,'operator*(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5522c68d2ae330209abc2765d6b50992',1,'operator*(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacef4b96ed094bbed58d13a7071d1a87a',1,'operator*(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5bd92d93ed5dbf9714a033550a83ed',1,'operator*(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac18603d03fbcfdfd23751709f2238029',1,'operator*(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5afec7fb5b0492668e86c8181f441aa',1,'operator*(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2943f13db2702fddce4557a2e957c565',1,'operator*(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32454c9d98afba5f7144a92cd6bf5acb',1,'operator*(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16a1d022b4026918e85eaf28ac606a81',1,'operator*(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8c6dcb676ea367c9e1dd89fd4f0abf4',1,'operator*(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27de604fa033669bc0555199b31ef777',1,'operator*(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1edec141c59b8a684d2592d1420949a1',1,'operator*(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07a0d9f472b1baec9f5eabfff9d1eaf7',1,'operator*(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6be4a7723c490f8b150c714436100e12',1,'operator*(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddd96b00b4b034d26ce474707a4e5e1d',1,'operator*(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7ef727c5051a2421616f0517740d984',1,'operator*(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11b210a1793cf8e3d930c11dfda9ae6e',1,'operator*(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55db9f51fac5b573deb32220a631ca9',1,'operator*(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28a4888db08301e51da23d006f382653',1,'operator*(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7020c56e082be84fca69fa2c9916a4e',1,'operator*(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c25ca47380b7997200bb81a88f0323',1,'operator*(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7b92c373c28a5c4e44617cbbe8b28d8',1,'operator*(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dff9b27265d9a0d0b246618c2f6d190',1,'operator*(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e7e1c4649f286432072ebf0bbcaa069',1,'operator*(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98148cbe18fa5a1fe9cc37af9b2944da',1,'operator*(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8af39ddbfd14cda64dc1ea8312ddeaab',1,'operator*(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25a1baeb7c9b07639b599dcafb0a7dd1',1,'operator*(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cfca580e4aed7f30b018f5b3b5f04de',1,'operator*(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28a09636e8ddc34502754ef3cc45736',1,'operator*(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd4d86a80e9a8ba4d0b8191946a7c7e4',1,'operator*(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga500f12286f4bde3313357ee9b77522d8',1,'operator*(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b1789f57a51f5db4560fe91f26bbd1',1,'operator*(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5723f7cf916b1c9455c8581abcdeb505',1,'operator*(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0e897f09e26316ca2aa0cbb965e1835',1,'operator*(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga314f5a0e14f5b478c6c979776c26d203',1,'operator*(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819a0d444655998d3ae70cd93b283319',1,'operator*(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a5340751b48d6b199875c361804465',1,'operator*(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bce5ffd4058a6549f3bb651f50bfe46',1,'operator*(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ca0ada3b453db74593720374e9af90f',1,'operator*(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2228f02f69514b9ea9c3bd30df71d0',1,'operator*(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f24178f4139fa88be47e2b9f7126eb',1,'operator*(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82ad067165475e005f75eb902cbcf2f6',1,'operator*(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eca4d9d17555bb68127757943e54495',1,'operator*(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddaa9f9bc413848a741a108556de7f66',1,'operator*(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d937bc5dd036bbbc645b81f260b5b5',1,'operator*(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3cce3391058528e77d01b2f2aaf28f4',1,'operator*(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd32b6bf1571865c29d46f1ac091c5d',1,'operator*(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09b06dc7f40394668ea338909fdb11da',1,'operator*(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2561dcb50f1b343e79d929c85d9d6af2',1,'operator*(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab96739276183d3d037db1b31b54f98cb',1,'operator*(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bc8a2714623a07f6d32a01c5a02a19d',1,'operator*(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e546e55ec80d5ce6e41dd72c8091ad7',1,'operator*(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0f13827bf653baef99ce65166394e7f',1,'operator*(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19620047188467d968634de432862b30',1,'operator*(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9f8c286132b32a1d0d2f136b9304e9f',1,'operator*(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89bebd81801426221358914f44b9399f',1,'operator*(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad909b1577d5bc471b8ebc7d934253736',1,'operator*(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ddea16553b01373469d460fd8f5f9',1,'operator*(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd372b32bcd38be3dd4261d657c742fa',1,'operator*(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e03853be024cf4a58640b575d7b6122',1,'operator*(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b0ea30f8320cf30ca3b42aa699e1d11',1,'operator*(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4976047aad73ae11f14d5311b5efc643',1,'operator*(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d268df51117be47d5a192550113b2bb',1,'operator*(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga886827c0f13b44c8fa578f3d4bab6187',1,'operator*(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06546a623ef3a0292e0d0b5b9a241596',1,'operator*(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f215d83712628eb64664ca8edc729c3',1,'operator*(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322e5725d39b6a56b10217744fd54c84',1,'operator*(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ca17de0407d90a3cac404220b157d5',1,'operator*(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac169dc02de88236dc3287630549e7c32',1,'operator*(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d60d4ea2cc22ce5ae0cf0950b2148dd',1,'operator*(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95b4ecd54e292812be0faf0a93687fa5',1,'operator*(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9246aa07ab9cb8d3a42db71f45d804a',1,'operator*(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed19b40b852d4b05f7af20906f02df96',1,'operator*(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa8c599bd31954a5687b8a1ae2ba1696',1,'operator*(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ea6d03ee2c62f728d3fbfe71f16b259',1,'operator*(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dabe0e00519ed1f069e7682e7dc28d2',1,'operator*(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga916d16970792f1444932d3551460e762',1,'operator*(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0acc20bf74d011ff6eb0263efa31c91',1,'operator*(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacea516a696d7e15b81d71bc335a1be2b',1,'operator*(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67e2f781ad85fbc5b4b2759018ef0bc',1,'operator*(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cee4b43501cb0d54db315a9be3c00be',1,'operator*(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eb8ba99e7883f7e5208da1d56a63ea8',1,'operator*(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd127c751ea3d9b32c47a50503405eaa',1,'operator*(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea8d0ec3ad321a074118524061e9de9b',1,'operator*(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae972a64880e7f11f0b512bf4862c988d',1,'operator*(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae7124c60811e471f4ccea775e6a8105',1,'operator*(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefcfe41bdbb40358a627620664e43087',1,'operator*(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga532206b6078098de41bdb7cdee843242',1,'operator*(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6dde37f01013af843248fa57df5a4705',1,'operator*(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d83c6f1c934d58b0db96fb9b1031e4',1,'operator*(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0555787fcd7d58a8c94d0a4369c947',1,'operator*(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5305d06b4d7893f8d4fb352f6941d49',1,'operator*(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbccb0f7cfedd9faa5375d17e7acd9e6',1,'operator*(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d713228fed5e4b46d913ee514c4702',1,'operator*(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga416c75338bba0071cde9be85bdd14c8f',1,'operator*(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c4bf653481daa71869c6ec80f7ac7c',1,'operator*(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62bf09c0d8b2a28f9de71abb998ab55f',1,'operator*(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e873b6129892d4d634e0b541aa5a356',1,'operator*(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db9280a8455e340346203f8c8dbc45d',1,'operator*(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bfdc89f82d9717003387c1d237f5923',1,'operator*(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f86fba4880a36b6a7bd2394e161b34',1,'operator*(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f952a21290dc2760de145e020239a6',1,'operator*(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga530e3a25447a5113790059cf574c9d4d',1,'operator*(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga939ac4107ae2ef44cdba119f11a3e41b',1,'operator*(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa226675e3d5fa565377951e1fe2adf26',1,'operator*(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga032a606b459e22962751c5b5cb56721c',1,'operator*(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42182588882947c6d2ea60418ccfa53f',1,'operator*(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657fd69c2c2dbaa5bbd8f38e9086600c',1,'operator*(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga913025bdda9cfaf0a1d39fe6f912d32e',1,'operator*(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcfcf7d4b858ae3c794028e7c55b20a',1,'operator*(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b854a847e119bfbc02c2cc5de31787',1,'operator*(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb615b962e904782d9555a089708366d',1,'operator*(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b093cf980d6cabad1afbc4954ce86f9',1,'operator*(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0613453550f4199c8fe8734f2e7ef4cb',1,'operator*(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb4e9c2226edb173d19a520c69297f57',1,'operator*(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a441729d11f327aa925f6980920c810',1,'operator*(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c93c9c99656ffb2dcd5abda39efae1d',1,'operator*(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b2fee3c015fbd9323b9951b595639f0',1,'operator*(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1881d24ddb09d043dcd7c859e61b16',1,'operator*(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c0fa10b8bed67d42ab55dc2208107f8',1,'operator*(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga027915df6e568365ecfa3e12a5e677f4',1,'operator*(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58bcfcef533a71a0a1a9ee50738d257c',1,'operator*(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5920528b65944ed40e4497447d8e0316',1,'operator*(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44418d16b815d5057b17b2a34246734c',1,'operator*(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d29745317c743241a4d85cedc91bf88',1,'operator*(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cbf71951b93eea0b5a076f7d18a7451',1,'operator*(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e048d5a2db1da9b1575aebd01b047bb',1,'operator*(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga663d40c6e2002f25c436d52d82b2c690',1,'operator*(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7bd29f68c70d0a3b1b705f889140d0e',1,'operator*(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4030fb67021c4472688f397dc551adb',1,'operator*(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3476d190ac862ed33f50e5178938f6a',1,'operator*(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04af26fcf72bcf1ea89a3406eb81dc56',1,'operator*(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01861575c1321bb4e37ba4ff91b8f7dc',1,'operator*(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9601e46278afcfaa677985f801a57d76',1,'operator*(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab805b6e07f01115a8e08afa3108525',1,'operator*(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a3751f548f681546118362181963dae',1,'operator*(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8075bb13162203e07a2b9276b42aa063',1,'operator*(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f7ee241d6ee1a6a20c735286770c6f',1,'operator*(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga789c8bfcf46261d2c0c69901bfc53c61',1,'operator*(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33a577374fa11cf0c7d9debceed5d70b',1,'operator*(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab14d1e659db18b0c671ca9dbf9e0048f',1,'operator*(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfad4cd4b1abf7ed115e9261d4fafaf1',1,'operator*(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95434e47c47ea25a3a6d9f1906258286',1,'operator*(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66aff7a10720233331180655c8be700d',1,'operator*(double s, const double4 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga198533c477a87a54b78d348778d6a246',1,'std::operator*(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gadcae3a7fb5244e221cbab5efb79b56c4',1,'std::operator*(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga410ff39982a7970454bfe8e1ce7ddcf7',1,'std::operator*(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga198533c477a87a54b78d348778d6a246',1,'operator*(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gadcae3a7fb5244e221cbab5efb79b56c4',1,'operator*(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga410ff39982a7970454bfe8e1ce7ddcf7',1,'operator*(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad225313de8037d40c2d26c17edf1a9fd',1,'Eigen::operator*(const InverseImpl< PermutationType, PermutationStorage > &tperm, const SparseMatrixBase< SparseDerived > &matrix)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a9723b3ff0f2c99fe1081e3eb14380d4c',1,'Eigen::operator*(const MatrixBase< MatrixDerived > &matrix, const PermutationBase< PermutationDerived > &permutation)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a06ca1e6b1a30b4dd0f2633664fe4d956',1,'Eigen::operator*(const MatrixBase< MatrixDerived > &matrix, const TranspositionsBase< TranspositionsDerived > &transpositions)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a634bfd5e206a2e77f799b4c3956ea49e',1,'Eigen::operator*(const MatrixBase< OtherDerived > &other, const HouseholderSequence< VectorsType, CoeffsType, Side > &h)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a02fbb1bbd915b899b34a56a3cd64c438',1,'Eigen::operator*(const PermutationBase< PermDerived > &perm, const SparseMatrixBase< SparseDerived > &matrix)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a4d2abe28092f8070e971494c7e0b507a',1,'Eigen::operator*(const PermutationBase< PermutationDerived > &permutation, const MatrixBase< MatrixDerived > &matrix)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a8b7051d2f98498d619044089949f931d',1,'Eigen::operator*(const SparseMatrixBase< SparseDerived > &matrix, const InverseImpl< PermutationType, PermutationStorage > &tperm)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a429958a0e6bd27168f3935d3100c55cf',1,'Eigen::operator*(const SparseMatrixBase< SparseDerived > &matrix, const PermutationBase< PermDerived > &perm)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a02b783ce2d2464d4f4a0bc0d1dc494f0',1,'Eigen::operator*(const TranspositionsBase< TranspositionsDerived > &transpositions, const MatrixBase< MatrixDerived > &matrix)']]], - ['operator_2a_3d_325',['operator*=',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadfb86357bfb8cd27685582d3b7bb49ab',1,'cv::softdouble::operator*=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga412ec9d48b6f525b0ca44cfe4a2f12f9',1,'cv::softfloat::operator*=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'cv::Vec::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'cv::Vec::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 2 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 2 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 3 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 3 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 4 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 4 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 2 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 2 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 3 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 3 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga7bb2f4f7a2db97ebfa07181ba6435d1a',1,'std::complex::operator*=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaa495c7cb0718149e6a34650bc5ec4e1',1,'std::complex::operator*=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga84520c24cc0701e3f2bbeaea755e4aa2',1,'std::gslice_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac530f41a625a6f0842fc4fda0cb98189',1,'std::indirect_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga1878d8ab7ea54a42bbd783172af8a8c2',1,'std::mask_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2ae66c8e0229b65881780cb0dbd55ef8',1,'std::slice_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga345cd13171b5d52efb4979a1b3930ea6',1,'std::valarray::operator*=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab5a419c3673c284962634894e9c1fc20',1,'std::valarray::operator*=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga345cd13171b5d52efb4979a1b3930ea6',1,'valarray< size_t >::operator*=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab5a419c3673c284962634894e9c1fc20',1,'valarray< size_t >::operator*=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a6a5ff80e9d85106a1c9958219961c21d',1,'Eigen::ArrayBase::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a6a5ff80e9d85106a1c9958219961c21d',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3783b6168995ca117a1c19fea3630ac4',1,'Eigen::MatrixBase::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3783b6168995ca117a1c19fea3630ac4',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3783b6168995ca117a1c19fea3630ac4',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'Eigen::QuaternionBase::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a84fd39c79d4ca547ef0ff6c3c1dfcfcb',1,'Eigen::Rotation2D::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#adb13b29d664962dc3f62551644f11e87',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'Eigen::VectorwiseOp::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Derived, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Derived, Vertical >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator*=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gae3a0bf0a7afa1dd2d3f4390220fd0934',1,'cv::operator*=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga412ec9d48b6f525b0ca44cfe4a2f12f9',1,'operator*=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadfb86357bfb8cd27685582d3b7bb49ab',1,'operator*=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gae3a0bf0a7afa1dd2d3f4390220fd0934',1,'operator*=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga7bb2f4f7a2db97ebfa07181ba6435d1a',1,'operator*=(const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaa495c7cb0718149e6a34650bc5ec4e1',1,'operator*=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga84520c24cc0701e3f2bbeaea755e4aa2',1,'operator*=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga345cd13171b5d52efb4979a1b3930ea6',1,'operator*=(const _Tp &)(Global Namespace)']]], - ['operator_2b_326',['operator+',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a366cabf9cd5b9a9fb0e313570c5b3cac',1,'cv::MatExpr::operator+(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a93d7d34c3f0b5dbc5d6171d0a0094f28',1,'cv::MatExpr::operator+(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aefc08124af851c90433c85f39fb63a7e',1,'cv::MatExpr::operator+(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a503c5fe1e1f66590b35969fc28ba1af7',1,'cv::MatExpr::operator+(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab866e1c69c03008f2f9c0d923c4dc861',1,'cv::MatExpr::operator+(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a65604e00ecb411bef65e3c668a4bdf63',1,'cv::MatExpr::operator+(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac9b4c182fe91d94500d290beb8098345',1,'cv::MatExpr::operator+(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4f77f0a2048840246c7f219c5a06f2ff',1,'cv::MatExpr::operator+(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5d74e36027bfe69b2a50c7d5cc53752b',1,'cv::MatExpr::operator+(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9694cf1e4e9fe627f8b701cb9f97f2d0',1,'cv::MatExpr::operator+(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a366cabf9cd5b9a9fb0e313570c5b3cac',1,'cv::MatExpr::operator+(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a93d7d34c3f0b5dbc5d6171d0a0094f28',1,'cv::MatExpr::operator+(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aefc08124af851c90433c85f39fb63a7e',1,'cv::MatExpr::operator+(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a503c5fe1e1f66590b35969fc28ba1af7',1,'cv::MatExpr::operator+(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab866e1c69c03008f2f9c0d923c4dc861',1,'cv::MatExpr::operator+(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a65604e00ecb411bef65e3c668a4bdf63',1,'cv::MatExpr::operator+(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac9b4c182fe91d94500d290beb8098345',1,'cv::MatExpr::operator+(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4f77f0a2048840246c7f219c5a06f2ff',1,'cv::MatExpr::operator+(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5d74e36027bfe69b2a50c7d5cc53752b',1,'cv::MatExpr::operator+(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9694cf1e4e9fe627f8b701cb9f97f2d0',1,'cv::MatExpr::operator+(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'cv::Matx::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'cv::Matx::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< _Tp, cn, 1 >::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< _Tp, cn, 1 >::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 1, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 1, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 2 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 2 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 4, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 4, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, cn, 1 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, cn, 1 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 2, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 2, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 3, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 3, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, cn, 1 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, cn, 1 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float_type, 4, 4 >::operator+(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float_type, 4, 4 >::operator+(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gacf49831e844a094b21a41a37df2189e8',1,'cv::softdouble::operator+()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadb3c3fbb5bf49638bcaeddbfd16f3df7',1,'cv::softfloat::operator+()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'cv::Vec::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'cv::Vec::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< _Tp, 4 >::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< _Tp, 4 >::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 2 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 2 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 3 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 3 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 4 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 4 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 2 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 2 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 3 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 3 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a6719627d8f502c54e16f321d1790e030',1,'std::fpos::operator+()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a936c0491dbd3dfadfdbee626478b7009',1,'std::reverse_iterator::operator+()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga33a3a90827549220500c99f95b095816',1,'std::valarray::operator+()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga33a3a90827549220500c99f95b095816',1,'valarray< size_t >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'Eigen::VectorwiseOp::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Derived, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Derived, Vertical >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator+()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga9d4eb51e74c435420686e52b53d915a0',1,'cv::operator+()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga385a1836312404fd848a8f74b8ad7864',1,'cv::cudev::operator+(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0564f5e1dc7986e8b367e5e18d628cf9',1,'cv::cudev::operator+(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5751f0f9eea09af7d7be1a7ff9a6419',1,'cv::cudev::operator+(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4926bad3815b360be75781d8f789a299',1,'cv::cudev::operator+(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487522cfe2377387f941eb27b11052f0',1,'cv::cudev::operator+(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5318bd8d2d748d2c2f2e85cfa83f4174',1,'cv::cudev::operator+(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a593b2d7e5a664703a3189cfa3e8a2b',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga401671318958313b03cab9656be10333',1,'cv::cudev::operator+(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34588ecb09ba0f5b8bce1932b71ac2dc',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab32742b4d82dacbf5b03c3caaa21ad6a',1,'cv::cudev::operator+(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb808a69e62713677618f7e6aa6bad1c',1,'cv::cudev::operator+(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e85ea3a9090037ad78ba58f8d0635d1',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa545ec34a0a8d0b6b566d40d6b06be4',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88558d974e34b06012625b059582f84f',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ef3164d983c6c208fa7eae2d04e4901',1,'cv::cudev::operator+(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00e830af93185b0b0d9254abb4a3ba25',1,'cv::cudev::operator+(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga360059063d9c94f6895ad04c5538caa2',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab09d02dd9ae9cba4fff849e8cb4f011b',1,'cv::cudev::operator+(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaee9d8126772df36af785513ee3f33a0',1,'cv::cudev::operator+(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7809d9f6135f58240496734783a0d8e7',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa48ac783fc4d8c222edc3a5fee93d08',1,'cv::cudev::operator+(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1413eaa25988525f32e8b0c38588aca4',1,'cv::cudev::operator+(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31142062b4480b36487e1ceaf5001c60',1,'cv::cudev::operator+(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657e5172dce9285cd3450207c231ba91',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c965673b83d820595742fcba9d84ae6',1,'cv::cudev::operator+(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c140fc976d1e3b806105fbc841c5c8b',1,'cv::cudev::operator+(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87375c057e8e240da0620c8d30375fae',1,'cv::cudev::operator+(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f396374a8c6eaab38c438aa19f61953',1,'cv::cudev::operator+(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafadeec24b1b0d32d74f4bf66913a4961',1,'cv::cudev::operator+(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4626d73f4a41498ea009b0405b6fc58',1,'cv::cudev::operator+(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafec18ef79d72a4abcb395b55fa950ecc',1,'cv::cudev::operator+(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd70100577469c4b17877014098c321c',1,'cv::cudev::operator+(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga070cddd435b54d39dd9f53202de91e70',1,'cv::cudev::operator+(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65c78b19985aebe50cff55cb91091cb5',1,'cv::cudev::operator+(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a8be678d5c6d59577d013b1bc0f659a',1,'cv::cudev::operator+(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad505ddfe2b0b2efd85712ee4ee151ee',1,'cv::cudev::operator+(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa716696f351b72ed62b2eb9298e92431',1,'cv::cudev::operator+(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24687bb3a3f43d4cf77051b7f61c5bb5',1,'cv::cudev::operator+(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286f2da548b65f5e52a36f3a0c1b6e72',1,'cv::cudev::operator+(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e7d1a9a90ccd15a67db5330d206d39',1,'cv::cudev::operator+(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdc537c7585647e3c6244b9ff20a0f8c',1,'cv::cudev::operator+(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ad4f702de359a5fc1a9ae0f7e8a675b',1,'cv::cudev::operator+(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac437623c5a924fb1f5ec76555bd9349c',1,'cv::cudev::operator+(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09c0474800254c2fe5df7078b22f0c4',1,'cv::cudev::operator+(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5f3e910fc0bfac66f7b492dfaffa89d',1,'cv::cudev::operator+(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc384f8555e474bf0b42ba3294efbbe',1,'cv::cudev::operator+(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga230f38bc05d616d730d39e284de2a572',1,'cv::cudev::operator+(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ea72be29807fa7a5e3e125bb28ae1da',1,'cv::cudev::operator+(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095e7b638083196b19aa23f0fefb7f8',1,'cv::cudev::operator+(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbbd16fd0445cc803b551cefccee7d84',1,'cv::cudev::operator+(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a507070ee180987e572c027ad63720',1,'cv::cudev::operator+(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c8c57cb603e887926b3ef02d1b1f60f',1,'cv::cudev::operator+(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga751771b8771fc49355177eec0a0c7d11',1,'cv::cudev::operator+(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38a48c26d465ac5004500358a3be3fce',1,'cv::cudev::operator+(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e50479d44fef2f0af1d8bde6e6be5ad',1,'cv::cudev::operator+(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d63e7a7da37c059ee00217e3ab7e4f5',1,'cv::cudev::operator+(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a5a7ffefbe42e9de70da5fa44e0ea4',1,'cv::cudev::operator+(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69524132efa29c8fc980d6064a5c4fe1',1,'cv::cudev::operator+(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84f6e2fa384a11c09c186bf90f942305',1,'cv::cudev::operator+(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9634185808bd5543bffebed158218603',1,'cv::cudev::operator+(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a6f9277eb1d9b4ad95fb976f74be75',1,'cv::cudev::operator+(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1603e29ec853a1114e2fb0815a51ea14',1,'cv::cudev::operator+(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0f4f24948f8a31dd58c7504e95ae',1,'cv::cudev::operator+(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97fa01c350fde8c17cf70e4a665b42b6',1,'cv::cudev::operator+(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fafcdc8062ddf5b9a78cae00c698bec',1,'cv::cudev::operator+(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1fd6fc4c1d59c4d53aa036558028249',1,'cv::cudev::operator+(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd40aac024e1bcaf8023c2e35ced21c1',1,'cv::cudev::operator+(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695049876ddf039f3165e81de036bedf',1,'cv::cudev::operator+(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b80304249a375b80a8ecc267010063c',1,'cv::cudev::operator+(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa15da58a45f9288fb35d6f8804d748c9',1,'cv::cudev::operator+(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2dc62a33db896daaa413d6ea63511cb',1,'cv::cudev::operator+(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d432caa595a9d4e640a86c17dc87b33',1,'cv::cudev::operator+(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecb6ed173735a3e47a133011930bf170',1,'cv::cudev::operator+(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e20dbff7f2045ab3c4be9470646731',1,'cv::cudev::operator+(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89417add04bd126c8f349fc38e0be984',1,'cv::cudev::operator+(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f625b502a1cce9022de0c517a258989',1,'cv::cudev::operator+(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c24ef33bcb0428c76d9000d0c2dda7',1,'cv::cudev::operator+(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b2125e71b80c7fbed85a25428e4c3ce',1,'cv::cudev::operator+(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf25af14c9fafc45956d1531db11144ec',1,'cv::cudev::operator+(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e4c43d9bd3c9baf188b342a11cb6c92',1,'cv::cudev::operator+(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbe87e48c185c1c553f1781c8e51a78b',1,'cv::cudev::operator+(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a9afd18666cabaaff2b5bc1c6953c3d',1,'cv::cudev::operator+(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d6cd004ebf0046d8d05ce58be122e81',1,'cv::cudev::operator+(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf1559bb0b4711ff843e1f8689b0a21b',1,'cv::cudev::operator+(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9722a56f762fd4695dba0a6f581f993a',1,'cv::cudev::operator+(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf855f9f25f4366fe40e26fe92a193707',1,'cv::cudev::operator+(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadedbaa5bcb6aa88fcbbb08af9a056f23',1,'cv::cudev::operator+(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d7795a199307f39f05a7a52b7de164',1,'cv::cudev::operator+(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga491957d2d9dfc406352ab6f9e8c1483e',1,'cv::cudev::operator+(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac82a73e58ad54a045e3d6f90d4f00e91',1,'cv::cudev::operator+(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5509c565962e42b79b574ad682fd5044',1,'cv::cudev::operator+(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27dfa9b51f3a3aef1cbb1e874a1ebb17',1,'cv::cudev::operator+(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd8c880d85625a11bbbe05dea82e01ef',1,'cv::cudev::operator+(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc977b3f2a65f34876a461d9f8518a0f',1,'cv::cudev::operator+(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9be7290ae6342d75ea634d0b164f1ff9',1,'cv::cudev::operator+(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c8f90f6f825fb29b485ffe50390bf9a',1,'cv::cudev::operator+(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0244726591afd293c8228ce596639a63',1,'cv::cudev::operator+(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b851bb2cf578a6c6fe7ef7f02231fa3',1,'cv::cudev::operator+(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac08b7d9bbd26916b5650d4c95cedfdf1',1,'cv::cudev::operator+(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga617aa0c6e7b5bab86edfba469189b518',1,'cv::cudev::operator+(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c8b32a9eb67e145f7e8e6a4f58ee446',1,'cv::cudev::operator+(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa78824f70ed6aff53a468ba69721b940',1,'cv::cudev::operator+(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133f66972b269764ee2ee346366e86f8',1,'cv::cudev::operator+(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf1feb32c0186aa799348a619b15d492',1,'cv::cudev::operator+(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd42be9af8cc02f9ef351bbfead86e9',1,'cv::cudev::operator+(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac578dbae14068cab12ed2474c3d4c26c',1,'cv::cudev::operator+(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaead47ecf6a982cd89d2bd0e641b3b7de',1,'cv::cudev::operator+(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad410367422b6d4613cd9b3267ba698ad',1,'cv::cudev::operator+(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec447276ee554fbeadb63b05ad85816d',1,'cv::cudev::operator+(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac50f4daaf1949b1ef02de731dd4ddf65',1,'cv::cudev::operator+(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bde0cbb5805451c231fdad81908f849',1,'cv::cudev::operator+(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3085b3839365b0059cf1d31f19a63e3b',1,'cv::cudev::operator+(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55869a964cfdd901e7f67148a2e7d39',1,'cv::cudev::operator+(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbe668aec66b824c71e9cedb3e81b476',1,'cv::cudev::operator+(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c65960614e3da3a1c84780c344fff3',1,'cv::cudev::operator+(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f012e7f890a1d981c451c061b18da4f',1,'cv::cudev::operator+(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5bc69c6f65a3267d86c10e9427e50b3',1,'cv::cudev::operator+(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32eb280bd3436219f82bd7749046ce95',1,'cv::cudev::operator+(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa38542588a556bd21f1a3965b23d8d7e',1,'cv::cudev::operator+(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d06cbe3afb88ccc14d64cfa586ebfd',1,'cv::cudev::operator+(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e2e78e19bf1e54a3e764c47de16439',1,'cv::cudev::operator+(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga705b07f251d4e2c6a1d387e47fb0ebbf',1,'cv::cudev::operator+(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ef44a2d91c634e28cb3b493e1f6c9e9',1,'cv::cudev::operator+(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c7ee9b5737344bec6da2ffa4e0131b9',1,'cv::cudev::operator+(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61a7a96d326eace5a635e011cb2c76de',1,'cv::cudev::operator+(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8e25981380ec4e29c96d742e16f4caf',1,'cv::cudev::operator+(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69182858edbcfc754983f725faed9caf',1,'cv::cudev::operator+(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58a0aa4ac62f9368f026cc9cae4ab27c',1,'cv::cudev::operator+(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4932125e3fb3d43e988f20d98c92088a',1,'cv::cudev::operator+(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80481ef157cd534a7917db2c17806e11',1,'cv::cudev::operator+(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1945ac3f9acb340d56b2a123b56e2b6',1,'cv::cudev::operator+(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cda29304020b62ea1023d4c78357da9',1,'cv::cudev::operator+(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3890c98225ce81b7a9563dcadcbaa726',1,'cv::cudev::operator+(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2729c40733ac42bc9d8e8f22515d280b',1,'cv::cudev::operator+(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga815dd0dd7f2c53d35d474093f4f280a5',1,'cv::cudev::operator+(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f87c194094f4b225e01acc41ab4794c',1,'cv::cudev::operator+(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2935ebf4613c634864ae4604a27887ac',1,'cv::cudev::operator+(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cf666905454d84b149ae1f48d67bcc7',1,'cv::cudev::operator+(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedaaa885c3e387fcd8a57556223aa7a6',1,'cv::cudev::operator+(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab897af788ef49fe0a09832df944d61df',1,'cv::cudev::operator+(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b4ee5d82e458102eeab773243ea035',1,'cv::cudev::operator+(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5661c7cb9979d6cc95e98a6b324f3027',1,'cv::cudev::operator+(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga215e0e32a513cc0a9d870aa2af9f8563',1,'cv::cudev::operator+(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66d278c2d4206520854c7bf1ccfe0f71',1,'cv::cudev::operator+(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22d7acef9c458758b9938b5c16ecf1a6',1,'cv::cudev::operator+(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c186b379a335e9c0934a7558d7ab6f',1,'cv::cudev::operator+(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa575be0a6a9b80ba0400783ee96172ff',1,'cv::cudev::operator+(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04e953ca224c70e9a2b72a2b32f2cbfd',1,'cv::cudev::operator+(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e63aa7508890f5fc5fe74de963be45',1,'cv::cudev::operator+(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b64430c28f9c83e524066f22576c72c',1,'cv::cudev::operator+(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2807cdcc4a5d60ad709603abceac15',1,'cv::cudev::operator+(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6843246a6684565e67ed25c20c26b274',1,'cv::cudev::operator+(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0d509dbc5cc5eca3f74d25bf58dc55f',1,'cv::cudev::operator+(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac178c31b30000975ec5f66528b8729cd',1,'cv::cudev::operator+(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd5263d626e5688f4eea2edab7d3181f',1,'cv::cudev::operator+(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101de5c53f41c316a19a38dae5b117fe',1,'cv::cudev::operator+(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf58403ff9e23b6cee2516093cd97591e',1,'cv::cudev::operator+(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa185dbf1eb74efb51f3c5b3df4a9779',1,'cv::cudev::operator+(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1ba272cc5c9a2e39be16e19d70f2b0f',1,'cv::cudev::operator+(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af6b3a5e6fae8011628bcba8f730fe6',1,'cv::cudev::operator+(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bea5e892ad256972784f4f242e238a6',1,'cv::cudev::operator+(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34e88270476eaec6947195ac65632fb3',1,'cv::cudev::operator+(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc25f8350d7b49e877a5056c01b0d3a',1,'cv::cudev::operator+(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49bb3b73cfc2d3814000189184c152e7',1,'cv::cudev::operator+(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b58436ecb19bfa8164de7f990262b3c',1,'cv::cudev::operator+(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2032e800d832a8073d0dc2faef8a2dcd',1,'cv::cudev::operator+(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cef590a05e646cd57f77e6ee0be2d54',1,'cv::cudev::operator+(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb7eb522b0b7eb2799e015cfa8b74f53',1,'cv::cudev::operator+(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2af58cde3e25ca7ac04bcf1f55b52b52',1,'cv::cudev::operator+(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9317db3a8d728e6cfa073f4d57f21451',1,'cv::cudev::operator+(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22fdf93a0c8baf015b0d4b3b2cae8647',1,'cv::cudev::operator+(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b86c6d7c58b0794918765f9c1b839b',1,'cv::cudev::operator+(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eb912d94c68c7c592a8abd305d70aa1',1,'cv::cudev::operator+(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0188cf93b31b6d645c8f34f3992acde',1,'cv::cudev::operator+(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa95c038dfcd6f3375fd02c768ad735',1,'cv::cudev::operator+(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72cbd50d5d37be4e5174a68c21197617',1,'cv::cudev::operator+(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb87110c2951164d19f445969b076e96',1,'cv::cudev::operator+(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3e30731dbc17b3371d8017ccecd7d8b',1,'cv::cudev::operator+(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee5ba2d0674493e83ef9f46c19d01780',1,'cv::cudev::operator+(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab720a95ea55112441355a03963e8cb33',1,'cv::cudev::operator+(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03459898b7324f26de2388149ab4405',1,'cv::cudev::operator+(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c6f1db356d455ca3a7f71e81b43c6cb',1,'cv::cudev::operator+(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b4fd2d02f582f3f5c3071a157733fef',1,'cv::cudev::operator+(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73ac7a1964fb9064b94b7000ae14b06c',1,'cv::cudev::operator+(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c37d85d76f27f899a71677bf2c87965',1,'cv::cudev::operator+(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad67577fc0a303c66c31bb1cf11f072f4',1,'cv::cudev::operator+(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga463d44e45ae112517e69b59e5c05d2a2',1,'cv::cudev::operator+(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d45696a36817a7e03096ccb93efd678',1,'cv::cudev::operator+(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab881ab61562effcbdfb223834615cf9b',1,'cv::cudev::operator+(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845975ac0aa7a6e6ebcc6a0a5ccd1c6d',1,'cv::cudev::operator+(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ba4d696f23852287e920f9e39edbbc',1,'cv::cudev::operator+(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32199ebd017e38ef320461f564645fb1',1,'cv::cudev::operator+(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a277011ea76600e79758badd705b678',1,'cv::cudev::operator+(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab43588987ff4b565dff1496dcd93ceae',1,'cv::cudev::operator+(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4152033d3851f97c38b771e239265f04',1,'cv::cudev::operator+(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d988af531245304baa08913efeb0640',1,'cv::cudev::operator+(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10081f4c12a23d7b318423b00c0db522',1,'cv::cudev::operator+(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247ce351637b9c0b52f4915a7d2c4f6b',1,'cv::cudev::operator+(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a268a36253f07ca021dcebfee47ad10',1,'cv::cudev::operator+(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bbe87b038e1f5206c9d675104f91641',1,'cv::cudev::operator+(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab21b3162568bd7ae01f795a239f30ae5',1,'cv::cudev::operator+(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f3015dbf9a8bfebccee4ff5f8f0a13',1,'cv::cudev::operator+(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15d13e591d5ee6826542214b0b74046d',1,'cv::cudev::operator+(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e4033519a3535d8a458fb00ebee1559',1,'cv::cudev::operator+(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931953ada1dffe875beabe1f8f7bd030',1,'cv::cudev::operator+(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f610a053e45fa3c16c26b8fdac93563',1,'cv::cudev::operator+(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ff42a78160f10c832b89c2a7164e9ed',1,'cv::cudev::operator+(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c92678779773f7e36cbb585aff566f',1,'cv::cudev::operator+(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22ace1eefc87813ef769f102b0b3769d',1,'cv::cudev::operator+(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4814b6e72f311d414e0850c0b06ff2c8',1,'cv::cudev::operator+(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b9b43b4642e35d27d7ac6daaae1cf1a',1,'cv::cudev::operator+(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfe6d281caa0fcb744e38d8bca4c8d10',1,'cv::cudev::operator+(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb868810dbd9f370826a464fbfd6b63a',1,'cv::cudev::operator+(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafca4bacae455e2b15d9120d3495dd896',1,'cv::cudev::operator+(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc478dda6bd01bc954b9c52305187699',1,'cv::cudev::operator+(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf711eec1f4565f53cc5b24ffb4a65913',1,'cv::cudev::operator+(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4a1f5111573c3bd3ecfd696a6de505',1,'cv::cudev::operator+(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c4d7c3df7d674b9ff59c463173a1af5',1,'cv::cudev::operator+(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b48c6860baafe07388ea2d096ea63a8',1,'cv::cudev::operator+(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81619ea66499b085d6230361d755efd1',1,'cv::cudev::operator+(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4abcffbca6e6949ee898f486b7e74862',1,'cv::cudev::operator+(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f85134d8553add116bd4111d710dfe6',1,'cv::cudev::operator+(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a5b0f36ca97b7681786abe433e95225',1,'cv::cudev::operator+(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bca16e176bdf04054bf50edd8434825',1,'cv::cudev::operator+(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadb3c3fbb5bf49638bcaeddbfd16f3df7',1,'operator+(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gacf49831e844a094b21a41a37df2189e8',1,'operator+(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga9d4eb51e74c435420686e52b53d915a0',1,'operator+(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga385a1836312404fd848a8f74b8ad7864',1,'operator+(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0564f5e1dc7986e8b367e5e18d628cf9',1,'operator+(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5751f0f9eea09af7d7be1a7ff9a6419',1,'operator+(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4926bad3815b360be75781d8f789a299',1,'operator+(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487522cfe2377387f941eb27b11052f0',1,'operator+(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5318bd8d2d748d2c2f2e85cfa83f4174',1,'operator+(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a593b2d7e5a664703a3189cfa3e8a2b',1,'operator+(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga401671318958313b03cab9656be10333',1,'operator+(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34588ecb09ba0f5b8bce1932b71ac2dc',1,'operator+(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab32742b4d82dacbf5b03c3caaa21ad6a',1,'operator+(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb808a69e62713677618f7e6aa6bad1c',1,'operator+(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e85ea3a9090037ad78ba58f8d0635d1',1,'operator+(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa545ec34a0a8d0b6b566d40d6b06be4',1,'operator+(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88558d974e34b06012625b059582f84f',1,'operator+(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ef3164d983c6c208fa7eae2d04e4901',1,'operator+(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00e830af93185b0b0d9254abb4a3ba25',1,'operator+(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga360059063d9c94f6895ad04c5538caa2',1,'operator+(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab09d02dd9ae9cba4fff849e8cb4f011b',1,'operator+(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaee9d8126772df36af785513ee3f33a0',1,'operator+(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7809d9f6135f58240496734783a0d8e7',1,'operator+(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa48ac783fc4d8c222edc3a5fee93d08',1,'operator+(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1413eaa25988525f32e8b0c38588aca4',1,'operator+(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31142062b4480b36487e1ceaf5001c60',1,'operator+(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657e5172dce9285cd3450207c231ba91',1,'operator+(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c965673b83d820595742fcba9d84ae6',1,'operator+(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c140fc976d1e3b806105fbc841c5c8b',1,'operator+(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87375c057e8e240da0620c8d30375fae',1,'operator+(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f396374a8c6eaab38c438aa19f61953',1,'operator+(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafadeec24b1b0d32d74f4bf66913a4961',1,'operator+(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4626d73f4a41498ea009b0405b6fc58',1,'operator+(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafec18ef79d72a4abcb395b55fa950ecc',1,'operator+(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd70100577469c4b17877014098c321c',1,'operator+(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga070cddd435b54d39dd9f53202de91e70',1,'operator+(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65c78b19985aebe50cff55cb91091cb5',1,'operator+(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a8be678d5c6d59577d013b1bc0f659a',1,'operator+(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad505ddfe2b0b2efd85712ee4ee151ee',1,'operator+(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa716696f351b72ed62b2eb9298e92431',1,'operator+(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24687bb3a3f43d4cf77051b7f61c5bb5',1,'operator+(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286f2da548b65f5e52a36f3a0c1b6e72',1,'operator+(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e7d1a9a90ccd15a67db5330d206d39',1,'operator+(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdc537c7585647e3c6244b9ff20a0f8c',1,'operator+(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ad4f702de359a5fc1a9ae0f7e8a675b',1,'operator+(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac437623c5a924fb1f5ec76555bd9349c',1,'operator+(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09c0474800254c2fe5df7078b22f0c4',1,'operator+(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5f3e910fc0bfac66f7b492dfaffa89d',1,'operator+(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc384f8555e474bf0b42ba3294efbbe',1,'operator+(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga230f38bc05d616d730d39e284de2a572',1,'operator+(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ea72be29807fa7a5e3e125bb28ae1da',1,'operator+(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095e7b638083196b19aa23f0fefb7f8',1,'operator+(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbbd16fd0445cc803b551cefccee7d84',1,'operator+(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a507070ee180987e572c027ad63720',1,'operator+(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c8c57cb603e887926b3ef02d1b1f60f',1,'operator+(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga751771b8771fc49355177eec0a0c7d11',1,'operator+(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38a48c26d465ac5004500358a3be3fce',1,'operator+(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e50479d44fef2f0af1d8bde6e6be5ad',1,'operator+(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d63e7a7da37c059ee00217e3ab7e4f5',1,'operator+(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a5a7ffefbe42e9de70da5fa44e0ea4',1,'operator+(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69524132efa29c8fc980d6064a5c4fe1',1,'operator+(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84f6e2fa384a11c09c186bf90f942305',1,'operator+(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9634185808bd5543bffebed158218603',1,'operator+(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a6f9277eb1d9b4ad95fb976f74be75',1,'operator+(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1603e29ec853a1114e2fb0815a51ea14',1,'operator+(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0f4f24948f8a31dd58c7504e95ae',1,'operator+(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97fa01c350fde8c17cf70e4a665b42b6',1,'operator+(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fafcdc8062ddf5b9a78cae00c698bec',1,'operator+(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1fd6fc4c1d59c4d53aa036558028249',1,'operator+(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd40aac024e1bcaf8023c2e35ced21c1',1,'operator+(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695049876ddf039f3165e81de036bedf',1,'operator+(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b80304249a375b80a8ecc267010063c',1,'operator+(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa15da58a45f9288fb35d6f8804d748c9',1,'operator+(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2dc62a33db896daaa413d6ea63511cb',1,'operator+(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d432caa595a9d4e640a86c17dc87b33',1,'operator+(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecb6ed173735a3e47a133011930bf170',1,'operator+(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e20dbff7f2045ab3c4be9470646731',1,'operator+(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89417add04bd126c8f349fc38e0be984',1,'operator+(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f625b502a1cce9022de0c517a258989',1,'operator+(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c24ef33bcb0428c76d9000d0c2dda7',1,'operator+(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b2125e71b80c7fbed85a25428e4c3ce',1,'operator+(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf25af14c9fafc45956d1531db11144ec',1,'operator+(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e4c43d9bd3c9baf188b342a11cb6c92',1,'operator+(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbe87e48c185c1c553f1781c8e51a78b',1,'operator+(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a9afd18666cabaaff2b5bc1c6953c3d',1,'operator+(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d6cd004ebf0046d8d05ce58be122e81',1,'operator+(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf1559bb0b4711ff843e1f8689b0a21b',1,'operator+(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9722a56f762fd4695dba0a6f581f993a',1,'operator+(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf855f9f25f4366fe40e26fe92a193707',1,'operator+(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadedbaa5bcb6aa88fcbbb08af9a056f23',1,'operator+(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d7795a199307f39f05a7a52b7de164',1,'operator+(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga491957d2d9dfc406352ab6f9e8c1483e',1,'operator+(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac82a73e58ad54a045e3d6f90d4f00e91',1,'operator+(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5509c565962e42b79b574ad682fd5044',1,'operator+(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27dfa9b51f3a3aef1cbb1e874a1ebb17',1,'operator+(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd8c880d85625a11bbbe05dea82e01ef',1,'operator+(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc977b3f2a65f34876a461d9f8518a0f',1,'operator+(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9be7290ae6342d75ea634d0b164f1ff9',1,'operator+(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c8f90f6f825fb29b485ffe50390bf9a',1,'operator+(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0244726591afd293c8228ce596639a63',1,'operator+(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b851bb2cf578a6c6fe7ef7f02231fa3',1,'operator+(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac08b7d9bbd26916b5650d4c95cedfdf1',1,'operator+(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga617aa0c6e7b5bab86edfba469189b518',1,'operator+(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c8b32a9eb67e145f7e8e6a4f58ee446',1,'operator+(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa78824f70ed6aff53a468ba69721b940',1,'operator+(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133f66972b269764ee2ee346366e86f8',1,'operator+(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf1feb32c0186aa799348a619b15d492',1,'operator+(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd42be9af8cc02f9ef351bbfead86e9',1,'operator+(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac578dbae14068cab12ed2474c3d4c26c',1,'operator+(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaead47ecf6a982cd89d2bd0e641b3b7de',1,'operator+(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad410367422b6d4613cd9b3267ba698ad',1,'operator+(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec447276ee554fbeadb63b05ad85816d',1,'operator+(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac50f4daaf1949b1ef02de731dd4ddf65',1,'operator+(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bde0cbb5805451c231fdad81908f849',1,'operator+(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3085b3839365b0059cf1d31f19a63e3b',1,'operator+(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55869a964cfdd901e7f67148a2e7d39',1,'operator+(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbe668aec66b824c71e9cedb3e81b476',1,'operator+(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c65960614e3da3a1c84780c344fff3',1,'operator+(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f012e7f890a1d981c451c061b18da4f',1,'operator+(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5bc69c6f65a3267d86c10e9427e50b3',1,'operator+(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32eb280bd3436219f82bd7749046ce95',1,'operator+(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa38542588a556bd21f1a3965b23d8d7e',1,'operator+(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d06cbe3afb88ccc14d64cfa586ebfd',1,'operator+(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e2e78e19bf1e54a3e764c47de16439',1,'operator+(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga705b07f251d4e2c6a1d387e47fb0ebbf',1,'operator+(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ef44a2d91c634e28cb3b493e1f6c9e9',1,'operator+(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c7ee9b5737344bec6da2ffa4e0131b9',1,'operator+(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61a7a96d326eace5a635e011cb2c76de',1,'operator+(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8e25981380ec4e29c96d742e16f4caf',1,'operator+(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69182858edbcfc754983f725faed9caf',1,'operator+(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58a0aa4ac62f9368f026cc9cae4ab27c',1,'operator+(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4932125e3fb3d43e988f20d98c92088a',1,'operator+(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80481ef157cd534a7917db2c17806e11',1,'operator+(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1945ac3f9acb340d56b2a123b56e2b6',1,'operator+(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cda29304020b62ea1023d4c78357da9',1,'operator+(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3890c98225ce81b7a9563dcadcbaa726',1,'operator+(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2729c40733ac42bc9d8e8f22515d280b',1,'operator+(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga815dd0dd7f2c53d35d474093f4f280a5',1,'operator+(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f87c194094f4b225e01acc41ab4794c',1,'operator+(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2935ebf4613c634864ae4604a27887ac',1,'operator+(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cf666905454d84b149ae1f48d67bcc7',1,'operator+(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedaaa885c3e387fcd8a57556223aa7a6',1,'operator+(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab897af788ef49fe0a09832df944d61df',1,'operator+(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b4ee5d82e458102eeab773243ea035',1,'operator+(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5661c7cb9979d6cc95e98a6b324f3027',1,'operator+(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga215e0e32a513cc0a9d870aa2af9f8563',1,'operator+(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66d278c2d4206520854c7bf1ccfe0f71',1,'operator+(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22d7acef9c458758b9938b5c16ecf1a6',1,'operator+(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c186b379a335e9c0934a7558d7ab6f',1,'operator+(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa575be0a6a9b80ba0400783ee96172ff',1,'operator+(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04e953ca224c70e9a2b72a2b32f2cbfd',1,'operator+(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e63aa7508890f5fc5fe74de963be45',1,'operator+(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b64430c28f9c83e524066f22576c72c',1,'operator+(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2807cdcc4a5d60ad709603abceac15',1,'operator+(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6843246a6684565e67ed25c20c26b274',1,'operator+(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0d509dbc5cc5eca3f74d25bf58dc55f',1,'operator+(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac178c31b30000975ec5f66528b8729cd',1,'operator+(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd5263d626e5688f4eea2edab7d3181f',1,'operator+(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101de5c53f41c316a19a38dae5b117fe',1,'operator+(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf58403ff9e23b6cee2516093cd97591e',1,'operator+(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa185dbf1eb74efb51f3c5b3df4a9779',1,'operator+(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1ba272cc5c9a2e39be16e19d70f2b0f',1,'operator+(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af6b3a5e6fae8011628bcba8f730fe6',1,'operator+(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bea5e892ad256972784f4f242e238a6',1,'operator+(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34e88270476eaec6947195ac65632fb3',1,'operator+(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc25f8350d7b49e877a5056c01b0d3a',1,'operator+(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49bb3b73cfc2d3814000189184c152e7',1,'operator+(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b58436ecb19bfa8164de7f990262b3c',1,'operator+(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2032e800d832a8073d0dc2faef8a2dcd',1,'operator+(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cef590a05e646cd57f77e6ee0be2d54',1,'operator+(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb7eb522b0b7eb2799e015cfa8b74f53',1,'operator+(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2af58cde3e25ca7ac04bcf1f55b52b52',1,'operator+(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9317db3a8d728e6cfa073f4d57f21451',1,'operator+(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22fdf93a0c8baf015b0d4b3b2cae8647',1,'operator+(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b86c6d7c58b0794918765f9c1b839b',1,'operator+(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eb912d94c68c7c592a8abd305d70aa1',1,'operator+(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0188cf93b31b6d645c8f34f3992acde',1,'operator+(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa95c038dfcd6f3375fd02c768ad735',1,'operator+(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72cbd50d5d37be4e5174a68c21197617',1,'operator+(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb87110c2951164d19f445969b076e96',1,'operator+(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3e30731dbc17b3371d8017ccecd7d8b',1,'operator+(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee5ba2d0674493e83ef9f46c19d01780',1,'operator+(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab720a95ea55112441355a03963e8cb33',1,'operator+(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03459898b7324f26de2388149ab4405',1,'operator+(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c6f1db356d455ca3a7f71e81b43c6cb',1,'operator+(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b4fd2d02f582f3f5c3071a157733fef',1,'operator+(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73ac7a1964fb9064b94b7000ae14b06c',1,'operator+(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c37d85d76f27f899a71677bf2c87965',1,'operator+(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad67577fc0a303c66c31bb1cf11f072f4',1,'operator+(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga463d44e45ae112517e69b59e5c05d2a2',1,'operator+(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d45696a36817a7e03096ccb93efd678',1,'operator+(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab881ab61562effcbdfb223834615cf9b',1,'operator+(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845975ac0aa7a6e6ebcc6a0a5ccd1c6d',1,'operator+(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ba4d696f23852287e920f9e39edbbc',1,'operator+(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32199ebd017e38ef320461f564645fb1',1,'operator+(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a277011ea76600e79758badd705b678',1,'operator+(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab43588987ff4b565dff1496dcd93ceae',1,'operator+(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4152033d3851f97c38b771e239265f04',1,'operator+(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d988af531245304baa08913efeb0640',1,'operator+(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10081f4c12a23d7b318423b00c0db522',1,'operator+(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247ce351637b9c0b52f4915a7d2c4f6b',1,'operator+(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a268a36253f07ca021dcebfee47ad10',1,'operator+(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bbe87b038e1f5206c9d675104f91641',1,'operator+(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab21b3162568bd7ae01f795a239f30ae5',1,'operator+(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f3015dbf9a8bfebccee4ff5f8f0a13',1,'operator+(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15d13e591d5ee6826542214b0b74046d',1,'operator+(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e4033519a3535d8a458fb00ebee1559',1,'operator+(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931953ada1dffe875beabe1f8f7bd030',1,'operator+(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f610a053e45fa3c16c26b8fdac93563',1,'operator+(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ff42a78160f10c832b89c2a7164e9ed',1,'operator+(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c92678779773f7e36cbb585aff566f',1,'operator+(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22ace1eefc87813ef769f102b0b3769d',1,'operator+(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4814b6e72f311d414e0850c0b06ff2c8',1,'operator+(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b9b43b4642e35d27d7ac6daaae1cf1a',1,'operator+(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfe6d281caa0fcb744e38d8bca4c8d10',1,'operator+(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb868810dbd9f370826a464fbfd6b63a',1,'operator+(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafca4bacae455e2b15d9120d3495dd896',1,'operator+(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc478dda6bd01bc954b9c52305187699',1,'operator+(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf711eec1f4565f53cc5b24ffb4a65913',1,'operator+(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4a1f5111573c3bd3ecfd696a6de505',1,'operator+(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c4d7c3df7d674b9ff59c463173a1af5',1,'operator+(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b48c6860baafe07388ea2d096ea63a8',1,'operator+(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81619ea66499b085d6230361d755efd1',1,'operator+(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4abcffbca6e6949ee898f486b7e74862',1,'operator+(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f85134d8553add116bd4111d710dfe6',1,'operator+(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a5b0f36ca97b7681786abe433e95225',1,'operator+(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bca16e176bdf04054bf50edd8434825',1,'operator+(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a7e943cfd42382fe2fcba3fd5b4fc1476',1,'__gnu_cxx::operator+(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ab2b89b39ac900719a3a14e634ec860a5',1,'__gnu_cxx::operator+(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#acc9338b2661112c05017dbdeb21df9c7',1,'__gnu_cxx::operator+(_CharT __lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ab0f3593c273db1a2619a43db92c66efe',1,'__gnu_cxx::operator+(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a72c2b3659c31815c11e1d6b1a1d7e924',1,'__gnu_cxx::operator+(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, _CharT __rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gafa26cb16064a2b5197bfa440c98bdd95',1,'std::operator+(const complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a31fffa82cc0872d928c7d11371c34c49',1,'std::operator+(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae220860a64ea80fb9522daf38053aa8f',1,'std::operator+(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a952b727c802635e947a9a6b64f2f3ed1',1,'std::operator+(_CharT __lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7ba297cc435f21d90383baeebae8652c',1,'std::operator+(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa8298429823127738ccdf0b66e07249e',1,'std::operator+(const basic_string< _CharT, _Traits, _Alloc > &__lhs, _CharT __rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gada3d19f6d35799895239d9d8da91b874',1,'std::operator+(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaaa550f4048e573f92e2fbfae0ce8eab',1,'std::operator+(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga0bc80c123fa74e604e7d598b7e2b3a50',1,'std::operator+(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gafa26cb16064a2b5197bfa440c98bdd95',1,'operator+(const complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gada3d19f6d35799895239d9d8da91b874',1,'operator+(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaaa550f4048e573f92e2fbfae0ce8eab',1,'operator+(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga0bc80c123fa74e604e7d598b7e2b3a50',1,'operator+(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga33a3a90827549220500c99f95b095816',1,'operator+() const(Global Namespace)']]], - ['operator_2b_2b_327',['operator++',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a6a06cf1a5b94057476a925f3f758c490',1,'cv::FileNodeIterator::operator++()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a4daed1197209314a7a9bada1cb21af53',1,'cv::FileNodeIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a70052c25251e3387d8ab80d86febef95',1,'cv::LineIterator::operator++()'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a79c1edcfb30865c5abec03e48f91bcdc',1,'cv::LineIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a7f30a14ed656e99d0297fb028316d23a',1,'cv::MatConstIterator::operator++()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a9ee1e96236b15dcadf6d383db272b49e',1,'cv::MatConstIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ae079204d24a71cbadf489e2a7be4fd17',1,'cv::MatConstIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a04b79539dc9788dd44ffe41dc737f008',1,'cv::MatConstIterator_::operator++(int)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a164083b962b0b7ac8df36e9a90a4fab1',1,'cv::MatIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a3046b334bfa46d6cb19596fe552b4eb9',1,'cv::MatIterator_::operator++(int)'],['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a3e686d47da475b75c9b8ec11723bb2f3',1,'cv::NAryMatIterator::operator++()'],['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a260701f031521ebeac69bcc35c02a0d9',1,'cv::NAryMatIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ad72bcf02305bcfcd92d4006621225fbd',1,'cv::SparseMatConstIterator::operator++()'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ac18bf0568c460ed4a3c652348ef3f6a8',1,'cv::SparseMatConstIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a6c4e03aa55423633e9b7ba5df92530f0',1,'cv::SparseMatConstIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a2a1bbc3e0dcbdd3a08a89397bfad38ee',1,'cv::SparseMatConstIterator_::operator++(int)'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a8685211cc25d171aa9687847a76406c0',1,'cv::SparseMatIterator::operator++()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#aa89c17982bf2f3d1057d2bc09d36462b',1,'cv::SparseMatIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a5dd3f1223ff101fd63a670102e1a805c',1,'cv::SparseMatIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#af5357404aa31635fe16fb7900c24e990',1,'cv::SparseMatIterator_::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#af083e59c576b9e4f483df16b7411c10f',1,'__gnu_debug::_Safe_iterator::operator++() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a0e18ec08b2e93621558f7ba5ced2dda6',1,'__gnu_debug::_Safe_iterator::operator++(int) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#ae86d3f9ac2f797a9231fb441c3a85f04',1,'__gnu_debug::_Safe_local_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a970d20722ad94a43afaa2e4db289f85e',1,'__gnu_debug::_Safe_local_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#ab5ee82c060324ccc10d02831a5270a7c',1,'__gnu_parallel::_GuardedIterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#af083e59c576b9e4f483df16b7411c10f',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator++() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a0e18ec08b2e93621558f7ba5ced2dda6',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator++(int) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#af083e59c576b9e4f483df16b7411c10f',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator++() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a0e18ec08b2e93621558f7ba5ced2dda6',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator++(int) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#aabeb7276d4ce2366c5bb6c9a9f213546',1,'const_iterator_::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#abb2e9ec96985b4c74418481ebb6e47e1',1,'const_iterator_::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#ae3ce4e8d7eab45011fa177454aecf378',1,'iterator_::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#ad5a05ab49fce8dd1c5eb8b807f0d84f5',1,'iterator_::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#a86e4cf04673011aa38c843b3eb44e2f8',1,'std::back_insert_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#ad9e4589271dccb8b64df10af255d4076',1,'std::back_insert_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#aac63c27293526bf0b0c4d4a2472ba785',1,'std::front_insert_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#a0bb8e39402c65287d891388eaea27c8b',1,'std::front_insert_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a66d30004d7402c9067fa8faadd7b8861',1,'std::insert_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a1d81a713bb24ef57aba0ce6dba2a84f0',1,'std::insert_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a4c45d7bfc4e2a3594fb8918017b4ac3a',1,'std::istreambuf_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#adb987d5d42a928df600f5068d8a9e1dc',1,'std::istreambuf_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ad925d614752b837a7147d44d322a6aad',1,'std::ostreambuf_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#a0e9d282823cd7811717ad6bd890f8626',1,'std::ostreambuf_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#af1cd40b1c657b09254c830a6db8bd207',1,'std::regex_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a5cc20a645b74551c5130c8740fe96d9e',1,'std::regex_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a7d7768b8573112a25b0f2a567fd2b72c',1,'std::regex_token_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a699a85d3f9aed40a35d338596b8b2f9e',1,'std::regex_token_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a785ca20b14ac95ee033695423ecf1d53',1,'std::reverse_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a27c37221dec91844c7a72cb9dc28441d',1,'std::reverse_iterator::operator++(int)']]], - ['operator_2b_3d_328',['operator+=',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a77b08ee6b326b9d83ed01de4b30930d2',1,'cv::FileNodeIterator::operator+=()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a52fbb4c870f2c7678c29d892cf8f8307',1,'cv::MatConstIterator::operator+=()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ae423bce6d88387faeb59c63a818b7627',1,'cv::MatConstIterator_::operator+=()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a3bc7e3002fdda7346c15a455352673b2',1,'cv::MatIterator_::operator+=()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'cv::Matx::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'cv::Matx::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< _Tp, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< _Tp, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 1, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 1, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 2 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 2 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float_type, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float_type, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c429977f1b260829de0a009f8105029',1,'cv::softdouble::operator+=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga478a5a673e3131fbfd1c7a357f878023',1,'cv::softfloat::operator+=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'cv::Vec::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'cv::Vec::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< _Tp, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< _Tp, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a4b8715fc8f6a53505b98b9b19b512453',1,'__gnu_cxx::__versa_string::operator+=(const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a79d20017299bbfc786b2d5540e5af61d',1,'__gnu_cxx::__versa_string::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac14c7143cc1a4ed1ad31593b4a8da43b',1,'__gnu_cxx::__versa_string::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a1a409030e39ba995df18fefc38525c2a',1,'__gnu_cxx::__versa_string::operator+=(std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'__gnu_debug::basic_string::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< _CharT >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< _CharT >::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< _CharT >::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< _CharT >::operator+=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(_Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< char >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< char >::operator+=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< char >::operator+=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< char >::operator+=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< value_type >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< value_type >::operator+=(const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< value_type >::operator+=(value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< value_type >::operator+=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'std::basic_string::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'std::basic_string::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'std::basic_string::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'std::basic_string::operator+=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a1994cceaeac8896749a47d2d61e6754f',1,'std::complex::operator+=(const _Tp &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gabf4797890e21e8f0f05b3a73aa215395',1,'std::complex::operator+=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a82884338bf22e5b2e47088240ee3603c',1,'std::fpos::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadaedde83c0c3dc087cd28fede7547179',1,'std::gslice_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaeb7b9d2b39d2312c117a50769114e26c',1,'std::indirect_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga3cd7a0e7c02e60936993f2f8d85d7e14',1,'std::mask_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a2060fd42f847719055e4b416650824ea',1,'std::reverse_iterator::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabffb22fe7508d7fb6b06e4ca76440fc0',1,'std::slice_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga75cc5c668aaade5ccc50b199d789e191',1,'std::valarray::operator+=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8b82cbb5b9eafa8c1fc86ae8678e1f36',1,'std::valarray::operator+=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga75cc5c668aaade5ccc50b199d789e191',1,'valarray< size_t >::operator+=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8b82cbb5b9eafa8c1fc86ae8678e1f36',1,'valarray< size_t >::operator+=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a9cc9fdb4d0d6eb80a45107b86aacbfed',1,'Eigen::ArrayBase::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a9cc9fdb4d0d6eb80a45107b86aacbfed',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a983cc3be0bbe11b3d041a415b76ce010',1,'Eigen::MatrixBase::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a983cc3be0bbe11b3d041a415b76ce010',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a983cc3be0bbe11b3d041a415b76ce010',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a1d2edf8ab80733b8b2620d8c2a3100d3',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'Eigen::VectorwiseOp::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Derived, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Derived, Vertical >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator+=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a40226d9c84fcb9cb948ae0c27b842c57.html#a40226d9c84fcb9cb948ae0c27b842c57',1,'nlohmann::basic_json::operator+=(basic_json &&val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_af643a4baa91f484b11af0e4437183115.html#af643a4baa91f484b11af0e4437183115',1,'nlohmann::basic_json::operator+=(const basic_json &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ae300819781bce2193369609457f70f30.html#ae300819781bce2193369609457f70f30',1,'nlohmann::basic_json::operator+=(const typename object_t::value_type &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac48302a8b4f8c2a6e30c2a7bff6abc49.html#ac48302a8b4f8c2a6e30c2a7bff6abc49',1,'nlohmann::basic_json::operator+=(initializer_list_t init)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1decb593e539029ba11c6fcc72c969cd',1,'cv::operator+=()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ab8d1fddfb94e88c939838e006e23e295',1,'cv::gapi::own::operator+=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga478a5a673e3131fbfd1c7a357f878023',1,'operator+=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c429977f1b260829de0a009f8105029',1,'operator+=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1decb593e539029ba11c6fcc72c969cd',1,'operator+=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gabf4797890e21e8f0f05b3a73aa215395',1,'operator+=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadaedde83c0c3dc087cd28fede7547179',1,'operator+=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga75cc5c668aaade5ccc50b199d789e191',1,'operator+=(const _Tp &)(Global Namespace)']]], - ['operator_2c_329',['operator,',['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html#a769e50401811af082c9e7fe51b7f5e7c',1,'cv::MatCommaInitializer_::operator,()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a76d12259ac3602278c8082f5fdbc9cec',1,'cv::MatxCommaInitializer::operator,()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a76d12259ac3602278c8082f5fdbc9cec',1,'MatxCommaInitializer< _Tp, m, 1 >::operator,()'],['https://docs.opencv.org/4.2.0/d1/d3e/classcv_1_1VecCommaInitializer.html#ad458955e9c77d81d8078d28e3444dcdf',1,'cv::VecCommaInitializer::operator,()']]], - ['operator_2d_330',['operator-',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a4ec58573be20ff741b7f4d21bc223635',1,'cv::FileNodeIterator::operator-(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a4ec58573be20ff741b7f4d21bc223635',1,'cv::FileNodeIterator::operator-(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae07cd7b4ce3474dbdb1a264e2f6e7b0d',1,'cv::MatExpr::operator-(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad424f126a496afadafb4b6c67a1ce174',1,'cv::MatExpr::operator-(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6ed1d63630a0498bae02e4a71e757342',1,'cv::MatExpr::operator-(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a268e1ccaa369123adf2215756e3fae6a',1,'cv::MatExpr::operator-(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad7a022ce69ea48d8d9110cb79ab27b6a',1,'cv::MatExpr::operator-(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab851dfc040860bcf008d19e4a5926b83',1,'cv::MatExpr::operator-(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0d1940f6e797fb5f8092db30db875bdf',1,'cv::MatExpr::operator-(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a881069f5bff2833f6319cf2e7769fdbe',1,'cv::MatExpr::operator-(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaacefdef37dffe5d5214939666fce32f',1,'cv::MatExpr::operator-(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a3e8db9cfa032043f31d40211508653b1',1,'cv::MatExpr::operator-(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a22ebbe4ce388179e64afe917fa369003',1,'cv::MatExpr::operator-(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a09f773558b48e56dfa061179599e11d0',1,'cv::MatExpr::operator-(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae07cd7b4ce3474dbdb1a264e2f6e7b0d',1,'cv::MatExpr::operator-(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad424f126a496afadafb4b6c67a1ce174',1,'cv::MatExpr::operator-(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6ed1d63630a0498bae02e4a71e757342',1,'cv::MatExpr::operator-(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a268e1ccaa369123adf2215756e3fae6a',1,'cv::MatExpr::operator-(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad7a022ce69ea48d8d9110cb79ab27b6a',1,'cv::MatExpr::operator-(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab851dfc040860bcf008d19e4a5926b83',1,'cv::MatExpr::operator-(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0d1940f6e797fb5f8092db30db875bdf',1,'cv::MatExpr::operator-(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a881069f5bff2833f6319cf2e7769fdbe',1,'cv::MatExpr::operator-(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaacefdef37dffe5d5214939666fce32f',1,'cv::MatExpr::operator-(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a3e8db9cfa032043f31d40211508653b1',1,'cv::MatExpr::operator-(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a22ebbe4ce388179e64afe917fa369003',1,'cv::MatExpr::operator-(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a09f773558b48e56dfa061179599e11d0',1,'cv::MatExpr::operator-(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf6a12deaeedcf12e67dc695caff1068',1,'cv::softdouble::operator-(const softdouble &) const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga8150a63cd7bd61db576f3d89082e8b5d',1,'cv::softdouble::operator-() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga00fec559cf58adaedb43c5092df36b84',1,'cv::softfloat::operator-(const softfloat &) const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6d151a3faa03d866700dd46f0ad04a',1,'cv::softfloat::operator-() const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#af2e0577cdf823db2436ffc2c3e5bf5d5',1,'std::fpos::operator-(streamoff __off) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a9cb8084ee1bb8395c4a5e7a937092425',1,'std::fpos::operator-(const fpos &__other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a3942515868778c8f04f5b34fd78d1fce',1,'std::reverse_iterator::operator-()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga028b49a6d0cf1f6afa48149603d953b2',1,'std::valarray::operator-()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga028b49a6d0cf1f6afa48149603d953b2',1,'valarray< size_t >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'Eigen::VectorwiseOp::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Derived, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Derived, Vertical >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator-()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga657904e675f20f6b84d7821cf1b02576',1,'cv::operator-()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5c17b1b5b5fe0b3b4e8e5bd32cbf72b',1,'cv::cudev::operator-(const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8218dac34f71c38487a697ea52557259',1,'cv::cudev::operator-(const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga369f1d0d8d3803abcc6e10bf145d4edd',1,'cv::cudev::operator-(const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cccd86250a11d8e232198edf4251f14',1,'cv::cudev::operator-(const Expr< Body > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafcebc509ca2a96c5b80ab1b96926b5c',1,'cv::cudev::operator-(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32e53e6cd3aa0aec01a90c11008c5a',1,'cv::cudev::operator-(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa812557e00bb932af910630701a2e6d5',1,'cv::cudev::operator-(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga212b4e512e56d38893b3d94109f19e5a',1,'cv::cudev::operator-(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga923d4bc9a45182d9ff86558f8c3b3e1a',1,'cv::cudev::operator-(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf43079f133408f0dd329fa6f1d316f34',1,'cv::cudev::operator-(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5400e7e698ff6fb2a8e8eb929b71e818',1,'cv::cudev::operator-(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07f833d814ae15aa1f7f06fc72285d71',1,'cv::cudev::operator-(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630122d5ecd56ab75dc7a740237d4277',1,'cv::cudev::operator-(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga589105db257ea2341d3edecdbd69e6cf',1,'cv::cudev::operator-(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c02a04ef1608ad485d445c8e43753b8',1,'cv::cudev::operator-(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbd34fbbcf43515301431c8978721c7a',1,'cv::cudev::operator-(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29b58bdfa78ef5c4d4beac53f7c79c35',1,'cv::cudev::operator-(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae523601438b231456102587a02d29ce0',1,'cv::cudev::operator-(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21579d3d75241e52a788ecda484e20d7',1,'cv::cudev::operator-(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae12acf38186bf6dc6895da587665d36c',1,'cv::cudev::operator-(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9befc50cf1641402af105f9b4ce54707',1,'cv::cudev::operator-(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad871c5ff9bf246716e00f7215515a672',1,'cv::cudev::operator-(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ae31a4395b49fa3b233e0c4ee9f78a1',1,'cv::cudev::operator-(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12f0079672bd7bd0b168ce527cb706b',1,'cv::cudev::operator-(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7852adc318a540c056ea73b49ae8286',1,'cv::cudev::operator-(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae414e560eefa2f108503e79e0a92ce79',1,'cv::cudev::operator-(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c78976f9105914f1896abb0b2ab712',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdaf3a734933d300a18e8e1573041e6a',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga595015df8ac886ee6161c8574c07b0bb',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f02e96ae1741da62734d90363e15b',1,'cv::cudev::operator-(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c2ec4b300add3f39cd2c2005fc9b03b',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga671d1eab95a685d83fb46a3caedaa0e4',1,'cv::cudev::operator-(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29088c5390150a10bd5900f805cf9562',1,'cv::cudev::operator-(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17c6cb1c28feab2d8e488026a90f789d',1,'cv::cudev::operator-(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c2b847a8648af7bb1bf5696a5593e1',1,'cv::cudev::operator-(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f2cad4b2513975e900f994e6ed677d6',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657470335930553724a92428b1eb9014',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa406a939d82354cec9279667daa1ca94',1,'cv::cudev::operator-(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b895e1f04d72d46b19f80936c9c0704',1,'cv::cudev::operator-(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49370160c90b69f0c6e98c898b527368',1,'cv::cudev::operator-(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f5ba88d0b852d2f86afc29e06f1e8a',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97c585e4f802affa218b50922504b4d7',1,'cv::cudev::operator-(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b8b588d37850f2a9d96602a6a5f7d67',1,'cv::cudev::operator-(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga222ce3784f3fc6433767ce8cdaa827f7',1,'cv::cudev::operator-(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2828d795db4524ad86acf6438336fa',1,'cv::cudev::operator-(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2684b612027b487618841db6c1850313',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7d0852b020342bc37b7e507a587905a',1,'cv::cudev::operator-(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9529413b121c4e0c8ee22482a4fab970',1,'cv::cudev::operator-(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5bf61216767dfa9c63290c776fc9dc30',1,'cv::cudev::operator-(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafffe9e12abf7a2013c656198bbfe4019',1,'cv::cudev::operator-(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f600b61f1a94b779ce862a1b2ddc83e',1,'cv::cudev::operator-(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3492f3658fe0c7b45d288f0700124307',1,'cv::cudev::operator-(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0ec17613882c822c1684d5e67aa3ff0',1,'cv::cudev::operator-(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01f9a0cf5655a5f3c4c2e78bde998754',1,'cv::cudev::operator-(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c66bc85731db1174c2eae7646fe8ae',1,'cv::cudev::operator-(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd83b96a13731954f8723e2275e3765',1,'cv::cudev::operator-(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157fca7e19a61dbf087d7654594d4e23',1,'cv::cudev::operator-(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55f1af68b4a753b3a6a3e078d91f1696',1,'cv::cudev::operator-(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf4e04da6c7b24130e4cc8e776a5339a',1,'cv::cudev::operator-(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73809cf57d17ff44a52c02c3b29ecfba',1,'cv::cudev::operator-(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6d871842daa1c70ea4caef8a76670ab',1,'cv::cudev::operator-(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3923c285bfc32ef157d97af42b4dbaa',1,'cv::cudev::operator-(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3091968102f4293b8a37fa22c26fde15',1,'cv::cudev::operator-(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga105d05b599ef729df2112db1626078c9',1,'cv::cudev::operator-(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fc141b8ac2f6e3aeba0e32424591d9',1,'cv::cudev::operator-(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c28d9ff3a737dfe37508d1608d4488',1,'cv::cudev::operator-(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace86d625860816056a815a5ac249841f',1,'cv::cudev::operator-(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c83494077d790efb9cce651ef5c8fb3',1,'cv::cudev::operator-(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fcb4deeb33df8bb7fabc3afdc922947',1,'cv::cudev::operator-(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d0e94e2a3ddb20e082a36b760b374c',1,'cv::cudev::operator-(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf528d8dbd1cb9132a7d8acc3f11b0a89',1,'cv::cudev::operator-(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd1c46a4dceccd18eff03077f8e8da83',1,'cv::cudev::operator-(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26feff449ac4dab327561cc7b98ae303',1,'cv::cudev::operator-(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f0d316266abadce36d9f95350939051',1,'cv::cudev::operator-(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a790596a24ef36db89348e75d2858c',1,'cv::cudev::operator-(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cebc4fe6b6f94f836752ced678af6d6',1,'cv::cudev::operator-(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7912128120aa37fc63d046a614da79',1,'cv::cudev::operator-(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31fa210affd71e287fb5e9b483d8b4b7',1,'cv::cudev::operator-(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39a6f71ae25763350c835bab9dde6025',1,'cv::cudev::operator-(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c17045262474d8006617bf00a10ada',1,'cv::cudev::operator-(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3af755936e984d2d83fe6b1f520d014',1,'cv::cudev::operator-(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff766239f9095c4845abc49acf0e2dd0',1,'cv::cudev::operator-(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga750fd24726debf7081fb1118125a6775',1,'cv::cudev::operator-(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae62193899bb9cc343fa962b4b521e36c',1,'cv::cudev::operator-(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166ed0bcb9dd638829729f92695b12d0',1,'cv::cudev::operator-(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80d8077257094293bb466dab861ac473',1,'cv::cudev::operator-(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772e599865fe047c41f93d58af5c36be',1,'cv::cudev::operator-(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d7fa5317dd05a15f21aa3be368d6c79',1,'cv::cudev::operator-(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafecaf20edf9038a419b4963a649f1362',1,'cv::cudev::operator-(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a7b9dbe190b22a08f72e3f9334e3171',1,'cv::cudev::operator-(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60818b7e8929ee3491aad14dc0bbf7e7',1,'cv::cudev::operator-(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55574f511139402e4cd6820b2e3edeba',1,'cv::cudev::operator-(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9d8281a359296fae7b6ec188101ed8e',1,'cv::cudev::operator-(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7dad42ade73d46813a094b64808c6b8',1,'cv::cudev::operator-(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d789399fa52f9690e6e01fe8d653bc9',1,'cv::cudev::operator-(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24bad9cc2b3b3ac10c819d8fd2ae54e',1,'cv::cudev::operator-(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga064176b3aa847d4e254c1ec1db3f8324',1,'cv::cudev::operator-(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb5d9702bcfe0a2527b510cc84938a4',1,'cv::cudev::operator-(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga459d5db54e31c46b4c5982f98e42fa77',1,'cv::cudev::operator-(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb64bc3f5c6ee79fc1869e51e0e20ea',1,'cv::cudev::operator-(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab72d0df44e48d58d0a83680bcc64c0cd',1,'cv::cudev::operator-(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f14ce38edfb19ba6890f42c9e4bc1c7',1,'cv::cudev::operator-(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ca19596afc498b95a6a7b19375e2776',1,'cv::cudev::operator-(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga830cd97a436668d9feeb2ff08daead24',1,'cv::cudev::operator-(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0447438f3f039aaf24fe21d502153a6c',1,'cv::cudev::operator-(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac95b6a94f1155b246a18f3b845e3cfa7',1,'cv::cudev::operator-(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabecf086f97f0c60573f81155ce6df359',1,'cv::cudev::operator-(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa1778a2f54eb6eafc3a395173fac5b',1,'cv::cudev::operator-(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c69722cf7d46b2ca923926d0a9e7c29',1,'cv::cudev::operator-(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301f25e5157f16b4a044760a1ba51957',1,'cv::cudev::operator-(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga234301df3e003ce08fa1154a6919c3e6',1,'cv::cudev::operator-(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga529a4056534c5e47aa59d256ad69795b',1,'cv::cudev::operator-(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe950dd17a8fa089fe286dc7513ed18b',1,'cv::cudev::operator-(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51346e7356a9c330b5874b3e3e8fdf7a',1,'cv::cudev::operator-(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga087dd0f490602b7f5212a8221cc4c631',1,'cv::cudev::operator-(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa922d047700892efb47a39e2b66e2df7',1,'cv::cudev::operator-(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga030665610f8a68470affbb8fc223480a',1,'cv::cudev::operator-(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9334f4344c1d1203f4e78bad75c7f7ac',1,'cv::cudev::operator-(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c175694697819d86c134405fef567d',1,'cv::cudev::operator-(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c871fd39d365299a7087e48c132e66',1,'cv::cudev::operator-(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35c6854bb46e9164eec0218f869a9b9',1,'cv::cudev::operator-(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97621dfd01d12393ecd93025efb3565f',1,'cv::cudev::operator-(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb1c3da793075b09989fc44ae3f1b9ed',1,'cv::cudev::operator-(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f6f8843f95be97da2d9dd97203a57a7',1,'cv::cudev::operator-(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4b21b2c12c7e804eff3159893bf0da',1,'cv::cudev::operator-(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f8acd15bb673d2ddb88d3fc032f7f46',1,'cv::cudev::operator-(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b1a551cfaf5a99c6fe30782af1dee38',1,'cv::cudev::operator-(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8718012438f8242708e0e7c59e30c0f3',1,'cv::cudev::operator-(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b256b2cc48a9181623a38977e3bac00',1,'cv::cudev::operator-(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58ed6ef928b50877a894f409e8464ac2',1,'cv::cudev::operator-(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77dd6b885a2b9b9b4c44d74be2dbfd74',1,'cv::cudev::operator-(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga599164264373b33e0a535211c0fdccb5',1,'cv::cudev::operator-(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99636b5731e60af2c22851c30f4e1cc2',1,'cv::cudev::operator-(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f068655bf1a117d63ee8d12c9123bc',1,'cv::cudev::operator-(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68155cb7567a70e34854e308bad38bf0',1,'cv::cudev::operator-(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6789124b74d1f4bd32bcbbf0501d6bd',1,'cv::cudev::operator-(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c14a811c0156b0a39c727300af59a3d',1,'cv::cudev::operator-(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628b15bea2200f623235e780644b4738',1,'cv::cudev::operator-(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaed8862546424053275a74eb182123b1',1,'cv::cudev::operator-(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf917f33a395906b4ee4b0d09d3abb4fa',1,'cv::cudev::operator-(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c898d588a40dd071eec1f8c2c74b39f',1,'cv::cudev::operator-(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd0d6d85ac669a3f90307e30aa3cbe00',1,'cv::cudev::operator-(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e5740217efa8fe0abf0abcc760328d',1,'cv::cudev::operator-(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9dd88cc2cbce6d9e4778d60fc7921f7',1,'cv::cudev::operator-(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b9334faac50e773d70fc8dfd0b5ecbe',1,'cv::cudev::operator-(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e525a4e0063c46db0f94eeb30818210',1,'cv::cudev::operator-(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81998f25744b975fc9ad36d109ac830b',1,'cv::cudev::operator-(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd199a5f6d3af032060b2c2d22651ba0',1,'cv::cudev::operator-(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587458f4a3b6baaae54d1bf38c608fdd',1,'cv::cudev::operator-(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c43181792568fdac96ab1f34606f45',1,'cv::cudev::operator-(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad30d5dabcda24d862172a45f57790b0d',1,'cv::cudev::operator-(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71cc98fe99d705fe3f356355a5972c54',1,'cv::cudev::operator-(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae1659d27c0d33e75d72445deaf55930',1,'cv::cudev::operator-(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98feed4df5a73a8ddd6d51b8321af344',1,'cv::cudev::operator-(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b4b59a36beb43c49f01fb86f1bc890',1,'cv::cudev::operator-(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0775017854d4e2b772d672168bd9a5c',1,'cv::cudev::operator-(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b1fa561df0ed7972108d66f89c5c496',1,'cv::cudev::operator-(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf9102f7c51e3a2d88b9073206820a55',1,'cv::cudev::operator-(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2316196b4a8bd1c46e519dd2fc4c3851',1,'cv::cudev::operator-(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3075a67dd4ae9b7543c5e4c897f5ff45',1,'cv::cudev::operator-(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9ba6b5d0f5f1a8ed6d93e4f0ab5e173',1,'cv::cudev::operator-(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedcf75a12dd00e1c503c9106e44a3e98',1,'cv::cudev::operator-(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01b9153cf9b4f0369155cb594e2d1349',1,'cv::cudev::operator-(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ff1bf6c7c124e0c8bd913479790866a',1,'cv::cudev::operator-(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabed2cc5868115ee18468aa3cebb3be19',1,'cv::cudev::operator-(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e312d4b86154b204240572d9e86effd',1,'cv::cudev::operator-(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0418e4172197c9fa9dcd41c9fb3b20f9',1,'cv::cudev::operator-(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b532e3190010cf8358b124e3dde328',1,'cv::cudev::operator-(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195ae36c11666e48a9947af768d97b44',1,'cv::cudev::operator-(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b120b8e056fc331b8069bf1a9ed6fff',1,'cv::cudev::operator-(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8362b5b231be23340c5fb8b99cbb375e',1,'cv::cudev::operator-(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga082c28863107b352ac51038a23d06300',1,'cv::cudev::operator-(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga915ab09a582414ca39929cdb812f758a',1,'cv::cudev::operator-(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ea8ddbac826668fdc04ab8f99e66d9',1,'cv::cudev::operator-(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc941af3597d7061a0661159a5469162',1,'cv::cudev::operator-(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94ea2c59d0991a2fc0298c7f5a24e50',1,'cv::cudev::operator-(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2270da17955731575fe008dc96c80bda',1,'cv::cudev::operator-(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ffb86ec221c92f569ae47db8d52119b',1,'cv::cudev::operator-(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab28b46e72d03a0922e710b43695f2',1,'cv::cudev::operator-(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga145db2039b6488ede1742843b830bbb2',1,'cv::cudev::operator-(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf3a6db03ab93d4b436c9f15c1e465a8',1,'cv::cudev::operator-(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6255c2cad7df67e3ad4f26a084d74747',1,'cv::cudev::operator-(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c8779b714a767af06374cf179cd7658',1,'cv::cudev::operator-(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3588ea327af30d0380dbf86c67fbbe26',1,'cv::cudev::operator-(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f7485ba0075a5d14504be9792dd6cda',1,'cv::cudev::operator-(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87cd3d2a3cfacd0af275e8f65e593c07',1,'cv::cudev::operator-(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga431f094ce3f6ed4a524c1456032d1e5c',1,'cv::cudev::operator-(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cb9157344792d1668368b76d2b53ef0',1,'cv::cudev::operator-(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e51e2db4cf854a1b534e27fef30aea5',1,'cv::cudev::operator-(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00481995ead0bbef7bcaabe8670ab440',1,'cv::cudev::operator-(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f6440ffc7c49757d421ff30eec6483a',1,'cv::cudev::operator-(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c8857ba62a6011efbd8731351b3668',1,'cv::cudev::operator-(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf70bf655a23b655608d8076f4feee13',1,'cv::cudev::operator-(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe035a4f4b0e3ea2ea1b7026a6c67dcd',1,'cv::cudev::operator-(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14497e7403c99dfbc1ff4bedc3d68f6',1,'cv::cudev::operator-(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d805c90bfeba48408241237e149aae6',1,'cv::cudev::operator-(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8a8ad77bfd017bc91c32cf644962ab7',1,'cv::cudev::operator-(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabdaef661a90228ba7259c77122b9a03',1,'cv::cudev::operator-(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e260d1cb3780fad10c72cadc0c49c0f',1,'cv::cudev::operator-(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf94b2d97816dcd6619274fb4feeae0f5',1,'cv::cudev::operator-(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2144e86d0a8c877122ccb1cbcfe55524',1,'cv::cudev::operator-(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a39a0486a0d1f390b5f009cb61d18d9',1,'cv::cudev::operator-(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcef7c7a90b8afae18f0e59c1e1ade46',1,'cv::cudev::operator-(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8802eb31440714af8c5920c08a8fbaf8',1,'cv::cudev::operator-(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf470cfb079490ca0efc9e425d8a23737',1,'cv::cudev::operator-(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b0501a5e044aaf1b9138c442f2422c2',1,'cv::cudev::operator-(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd60b5d630bd0b3ae6a4d8f53c5205',1,'cv::cudev::operator-(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1c549d5b7cc2b71327ce10502f39db',1,'cv::cudev::operator-(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99eba581458fcdf17f4e91d73459ce96',1,'cv::cudev::operator-(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c920201791dc95f7e59f0a77524a4d9',1,'cv::cudev::operator-(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf83e424e36e12a70fed05d67393f4fa9',1,'cv::cudev::operator-(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga869ba8c0391f2954ec9b51b84e4cb037',1,'cv::cudev::operator-(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286015c3a12eb08da7fee407884e7f35',1,'cv::cudev::operator-(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadece9875b31689e0880c626826fa8a14',1,'cv::cudev::operator-(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa095d5d102f9325c5700eb1fd989f69b',1,'cv::cudev::operator-(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga835e06caee26a307b42ac4b6cae3eb36',1,'cv::cudev::operator-(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f1f7629c16642fa581b16c2898a05ff',1,'cv::cudev::operator-(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf868783fdecde414693bbcb9db17628e',1,'cv::cudev::operator-(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga213848161d7be3d9c73dba5e709b079b',1,'cv::cudev::operator-(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac118a8f2d822cd667b833e12a796be34',1,'cv::cudev::operator-(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae51bb9b05a4f76f5c3a01cf3db5962',1,'cv::cudev::operator-(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d855d60a702b3918c841a26570601a3',1,'cv::cudev::operator-(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e27485d93087eacf685d1498e74f556',1,'cv::cudev::operator-(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5d66d9588e722109b30fac960662e64',1,'cv::cudev::operator-(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34688ab71722659850f777051315dc27',1,'cv::cudev::operator-(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga557b681e893a841fe02f17a00d62eaa1',1,'cv::cudev::operator-(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf80315d6f88dfcbcf02c76f8ee8f953c',1,'cv::cudev::operator-(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa89552d0de95801c80b2bb3a5e6435d1',1,'cv::cudev::operator-(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf23698f18f04d1250221e6746b4c9810',1,'cv::cudev::operator-(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fd1d6f3e17ba35584f39da603e25c82',1,'cv::cudev::operator-(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f33fccdd0d3fa940bd3f443b24f8d5',1,'cv::cudev::operator-(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ceff4b71ebb6b58c8efdb4de80df7cb',1,'cv::cudev::operator-(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236c690b63999f1e9f07c84fb1dedc5f',1,'cv::cudev::operator-(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1094d7d71d2aefc1869c72347e53d09f',1,'cv::cudev::operator-(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ce9e9e1c97e5f00df933988651acc3',1,'cv::cudev::operator-(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga183b0f68b7e993cf1d10ce74cf656f63',1,'cv::cudev::operator-(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c95d1121a4fd678e416dd219bc2eff2',1,'cv::cudev::operator-(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2c1e422a17e927b9bc13516d09691ef',1,'cv::cudev::operator-(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga377b580b41f8a05440b4a4298e79847c',1,'cv::cudev::operator-(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbdfcaf718602ea178cefb40abc3199b',1,'cv::cudev::operator-(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50daff19a60364c8d50211b6150f7bde',1,'cv::cudev::operator-(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46d693e48f72432105a7694db15cb16b',1,'cv::cudev::operator-(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c2a9c4da615af916d394e1357098827',1,'cv::cudev::operator-(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa834729f3bf1a45f6bccba9dc8df5872',1,'cv::cudev::operator-(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c42e1c911cd6ced910f9c7c39e6217',1,'cv::cudev::operator-(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28c6d90fc518cd3304a57dfc88446779',1,'cv::cudev::operator-(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07106a51535e185bcf711ed49575530d',1,'cv::cudev::operator-(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4c9e88d426e7f6991f6e34b107f56cc',1,'cv::cudev::operator-(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga00fec559cf58adaedb43c5092df36b84',1,'operator-(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6d151a3faa03d866700dd46f0ad04a',1,'operator-() const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf6a12deaeedcf12e67dc695caff1068',1,'operator-(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga657904e675f20f6b84d7821cf1b02576',1,'operator-(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5c17b1b5b5fe0b3b4e8e5bd32cbf72b',1,'operator-(const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8218dac34f71c38487a697ea52557259',1,'operator-(const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga369f1d0d8d3803abcc6e10bf145d4edd',1,'operator-(const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cccd86250a11d8e232198edf4251f14',1,'operator-(const Expr< Body > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafcebc509ca2a96c5b80ab1b96926b5c',1,'operator-(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32e53e6cd3aa0aec01a90c11008c5a',1,'operator-(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa812557e00bb932af910630701a2e6d5',1,'operator-(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga212b4e512e56d38893b3d94109f19e5a',1,'operator-(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga923d4bc9a45182d9ff86558f8c3b3e1a',1,'operator-(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf43079f133408f0dd329fa6f1d316f34',1,'operator-(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5400e7e698ff6fb2a8e8eb929b71e818',1,'operator-(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07f833d814ae15aa1f7f06fc72285d71',1,'operator-(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630122d5ecd56ab75dc7a740237d4277',1,'operator-(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga589105db257ea2341d3edecdbd69e6cf',1,'operator-(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c02a04ef1608ad485d445c8e43753b8',1,'operator-(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbd34fbbcf43515301431c8978721c7a',1,'operator-(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29b58bdfa78ef5c4d4beac53f7c79c35',1,'operator-(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae523601438b231456102587a02d29ce0',1,'operator-(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21579d3d75241e52a788ecda484e20d7',1,'operator-(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae12acf38186bf6dc6895da587665d36c',1,'operator-(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9befc50cf1641402af105f9b4ce54707',1,'operator-(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad871c5ff9bf246716e00f7215515a672',1,'operator-(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ae31a4395b49fa3b233e0c4ee9f78a1',1,'operator-(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12f0079672bd7bd0b168ce527cb706b',1,'operator-(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7852adc318a540c056ea73b49ae8286',1,'operator-(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae414e560eefa2f108503e79e0a92ce79',1,'operator-(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c78976f9105914f1896abb0b2ab712',1,'operator-(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdaf3a734933d300a18e8e1573041e6a',1,'operator-(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga595015df8ac886ee6161c8574c07b0bb',1,'operator-(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f02e96ae1741da62734d90363e15b',1,'operator-(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c2ec4b300add3f39cd2c2005fc9b03b',1,'operator-(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga671d1eab95a685d83fb46a3caedaa0e4',1,'operator-(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29088c5390150a10bd5900f805cf9562',1,'operator-(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17c6cb1c28feab2d8e488026a90f789d',1,'operator-(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c2b847a8648af7bb1bf5696a5593e1',1,'operator-(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f2cad4b2513975e900f994e6ed677d6',1,'operator-(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657470335930553724a92428b1eb9014',1,'operator-(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa406a939d82354cec9279667daa1ca94',1,'operator-(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b895e1f04d72d46b19f80936c9c0704',1,'operator-(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49370160c90b69f0c6e98c898b527368',1,'operator-(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f5ba88d0b852d2f86afc29e06f1e8a',1,'operator-(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97c585e4f802affa218b50922504b4d7',1,'operator-(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b8b588d37850f2a9d96602a6a5f7d67',1,'operator-(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga222ce3784f3fc6433767ce8cdaa827f7',1,'operator-(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2828d795db4524ad86acf6438336fa',1,'operator-(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2684b612027b487618841db6c1850313',1,'operator-(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7d0852b020342bc37b7e507a587905a',1,'operator-(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9529413b121c4e0c8ee22482a4fab970',1,'operator-(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5bf61216767dfa9c63290c776fc9dc30',1,'operator-(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafffe9e12abf7a2013c656198bbfe4019',1,'operator-(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f600b61f1a94b779ce862a1b2ddc83e',1,'operator-(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3492f3658fe0c7b45d288f0700124307',1,'operator-(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0ec17613882c822c1684d5e67aa3ff0',1,'operator-(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01f9a0cf5655a5f3c4c2e78bde998754',1,'operator-(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c66bc85731db1174c2eae7646fe8ae',1,'operator-(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd83b96a13731954f8723e2275e3765',1,'operator-(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157fca7e19a61dbf087d7654594d4e23',1,'operator-(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55f1af68b4a753b3a6a3e078d91f1696',1,'operator-(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf4e04da6c7b24130e4cc8e776a5339a',1,'operator-(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73809cf57d17ff44a52c02c3b29ecfba',1,'operator-(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6d871842daa1c70ea4caef8a76670ab',1,'operator-(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3923c285bfc32ef157d97af42b4dbaa',1,'operator-(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3091968102f4293b8a37fa22c26fde15',1,'operator-(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga105d05b599ef729df2112db1626078c9',1,'operator-(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fc141b8ac2f6e3aeba0e32424591d9',1,'operator-(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c28d9ff3a737dfe37508d1608d4488',1,'operator-(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace86d625860816056a815a5ac249841f',1,'operator-(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c83494077d790efb9cce651ef5c8fb3',1,'operator-(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fcb4deeb33df8bb7fabc3afdc922947',1,'operator-(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d0e94e2a3ddb20e082a36b760b374c',1,'operator-(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf528d8dbd1cb9132a7d8acc3f11b0a89',1,'operator-(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd1c46a4dceccd18eff03077f8e8da83',1,'operator-(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26feff449ac4dab327561cc7b98ae303',1,'operator-(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f0d316266abadce36d9f95350939051',1,'operator-(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a790596a24ef36db89348e75d2858c',1,'operator-(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cebc4fe6b6f94f836752ced678af6d6',1,'operator-(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7912128120aa37fc63d046a614da79',1,'operator-(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31fa210affd71e287fb5e9b483d8b4b7',1,'operator-(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39a6f71ae25763350c835bab9dde6025',1,'operator-(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c17045262474d8006617bf00a10ada',1,'operator-(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3af755936e984d2d83fe6b1f520d014',1,'operator-(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff766239f9095c4845abc49acf0e2dd0',1,'operator-(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga750fd24726debf7081fb1118125a6775',1,'operator-(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae62193899bb9cc343fa962b4b521e36c',1,'operator-(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166ed0bcb9dd638829729f92695b12d0',1,'operator-(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80d8077257094293bb466dab861ac473',1,'operator-(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772e599865fe047c41f93d58af5c36be',1,'operator-(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d7fa5317dd05a15f21aa3be368d6c79',1,'operator-(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafecaf20edf9038a419b4963a649f1362',1,'operator-(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a7b9dbe190b22a08f72e3f9334e3171',1,'operator-(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60818b7e8929ee3491aad14dc0bbf7e7',1,'operator-(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55574f511139402e4cd6820b2e3edeba',1,'operator-(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9d8281a359296fae7b6ec188101ed8e',1,'operator-(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7dad42ade73d46813a094b64808c6b8',1,'operator-(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d789399fa52f9690e6e01fe8d653bc9',1,'operator-(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24bad9cc2b3b3ac10c819d8fd2ae54e',1,'operator-(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga064176b3aa847d4e254c1ec1db3f8324',1,'operator-(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb5d9702bcfe0a2527b510cc84938a4',1,'operator-(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga459d5db54e31c46b4c5982f98e42fa77',1,'operator-(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb64bc3f5c6ee79fc1869e51e0e20ea',1,'operator-(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab72d0df44e48d58d0a83680bcc64c0cd',1,'operator-(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f14ce38edfb19ba6890f42c9e4bc1c7',1,'operator-(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ca19596afc498b95a6a7b19375e2776',1,'operator-(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga830cd97a436668d9feeb2ff08daead24',1,'operator-(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0447438f3f039aaf24fe21d502153a6c',1,'operator-(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac95b6a94f1155b246a18f3b845e3cfa7',1,'operator-(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabecf086f97f0c60573f81155ce6df359',1,'operator-(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa1778a2f54eb6eafc3a395173fac5b',1,'operator-(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c69722cf7d46b2ca923926d0a9e7c29',1,'operator-(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301f25e5157f16b4a044760a1ba51957',1,'operator-(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga234301df3e003ce08fa1154a6919c3e6',1,'operator-(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga529a4056534c5e47aa59d256ad69795b',1,'operator-(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe950dd17a8fa089fe286dc7513ed18b',1,'operator-(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51346e7356a9c330b5874b3e3e8fdf7a',1,'operator-(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga087dd0f490602b7f5212a8221cc4c631',1,'operator-(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa922d047700892efb47a39e2b66e2df7',1,'operator-(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga030665610f8a68470affbb8fc223480a',1,'operator-(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9334f4344c1d1203f4e78bad75c7f7ac',1,'operator-(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c175694697819d86c134405fef567d',1,'operator-(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c871fd39d365299a7087e48c132e66',1,'operator-(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35c6854bb46e9164eec0218f869a9b9',1,'operator-(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97621dfd01d12393ecd93025efb3565f',1,'operator-(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb1c3da793075b09989fc44ae3f1b9ed',1,'operator-(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f6f8843f95be97da2d9dd97203a57a7',1,'operator-(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4b21b2c12c7e804eff3159893bf0da',1,'operator-(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f8acd15bb673d2ddb88d3fc032f7f46',1,'operator-(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b1a551cfaf5a99c6fe30782af1dee38',1,'operator-(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8718012438f8242708e0e7c59e30c0f3',1,'operator-(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b256b2cc48a9181623a38977e3bac00',1,'operator-(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58ed6ef928b50877a894f409e8464ac2',1,'operator-(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77dd6b885a2b9b9b4c44d74be2dbfd74',1,'operator-(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga599164264373b33e0a535211c0fdccb5',1,'operator-(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99636b5731e60af2c22851c30f4e1cc2',1,'operator-(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f068655bf1a117d63ee8d12c9123bc',1,'operator-(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68155cb7567a70e34854e308bad38bf0',1,'operator-(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6789124b74d1f4bd32bcbbf0501d6bd',1,'operator-(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c14a811c0156b0a39c727300af59a3d',1,'operator-(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628b15bea2200f623235e780644b4738',1,'operator-(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaed8862546424053275a74eb182123b1',1,'operator-(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf917f33a395906b4ee4b0d09d3abb4fa',1,'operator-(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c898d588a40dd071eec1f8c2c74b39f',1,'operator-(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd0d6d85ac669a3f90307e30aa3cbe00',1,'operator-(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e5740217efa8fe0abf0abcc760328d',1,'operator-(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9dd88cc2cbce6d9e4778d60fc7921f7',1,'operator-(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b9334faac50e773d70fc8dfd0b5ecbe',1,'operator-(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e525a4e0063c46db0f94eeb30818210',1,'operator-(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81998f25744b975fc9ad36d109ac830b',1,'operator-(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd199a5f6d3af032060b2c2d22651ba0',1,'operator-(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587458f4a3b6baaae54d1bf38c608fdd',1,'operator-(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c43181792568fdac96ab1f34606f45',1,'operator-(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad30d5dabcda24d862172a45f57790b0d',1,'operator-(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71cc98fe99d705fe3f356355a5972c54',1,'operator-(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae1659d27c0d33e75d72445deaf55930',1,'operator-(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98feed4df5a73a8ddd6d51b8321af344',1,'operator-(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b4b59a36beb43c49f01fb86f1bc890',1,'operator-(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0775017854d4e2b772d672168bd9a5c',1,'operator-(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b1fa561df0ed7972108d66f89c5c496',1,'operator-(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf9102f7c51e3a2d88b9073206820a55',1,'operator-(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2316196b4a8bd1c46e519dd2fc4c3851',1,'operator-(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3075a67dd4ae9b7543c5e4c897f5ff45',1,'operator-(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9ba6b5d0f5f1a8ed6d93e4f0ab5e173',1,'operator-(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedcf75a12dd00e1c503c9106e44a3e98',1,'operator-(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01b9153cf9b4f0369155cb594e2d1349',1,'operator-(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ff1bf6c7c124e0c8bd913479790866a',1,'operator-(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabed2cc5868115ee18468aa3cebb3be19',1,'operator-(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e312d4b86154b204240572d9e86effd',1,'operator-(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0418e4172197c9fa9dcd41c9fb3b20f9',1,'operator-(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b532e3190010cf8358b124e3dde328',1,'operator-(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195ae36c11666e48a9947af768d97b44',1,'operator-(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b120b8e056fc331b8069bf1a9ed6fff',1,'operator-(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8362b5b231be23340c5fb8b99cbb375e',1,'operator-(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga082c28863107b352ac51038a23d06300',1,'operator-(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga915ab09a582414ca39929cdb812f758a',1,'operator-(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ea8ddbac826668fdc04ab8f99e66d9',1,'operator-(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc941af3597d7061a0661159a5469162',1,'operator-(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94ea2c59d0991a2fc0298c7f5a24e50',1,'operator-(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2270da17955731575fe008dc96c80bda',1,'operator-(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ffb86ec221c92f569ae47db8d52119b',1,'operator-(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab28b46e72d03a0922e710b43695f2',1,'operator-(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga145db2039b6488ede1742843b830bbb2',1,'operator-(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf3a6db03ab93d4b436c9f15c1e465a8',1,'operator-(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6255c2cad7df67e3ad4f26a084d74747',1,'operator-(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c8779b714a767af06374cf179cd7658',1,'operator-(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3588ea327af30d0380dbf86c67fbbe26',1,'operator-(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f7485ba0075a5d14504be9792dd6cda',1,'operator-(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87cd3d2a3cfacd0af275e8f65e593c07',1,'operator-(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga431f094ce3f6ed4a524c1456032d1e5c',1,'operator-(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cb9157344792d1668368b76d2b53ef0',1,'operator-(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e51e2db4cf854a1b534e27fef30aea5',1,'operator-(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00481995ead0bbef7bcaabe8670ab440',1,'operator-(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f6440ffc7c49757d421ff30eec6483a',1,'operator-(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c8857ba62a6011efbd8731351b3668',1,'operator-(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf70bf655a23b655608d8076f4feee13',1,'operator-(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe035a4f4b0e3ea2ea1b7026a6c67dcd',1,'operator-(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14497e7403c99dfbc1ff4bedc3d68f6',1,'operator-(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d805c90bfeba48408241237e149aae6',1,'operator-(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8a8ad77bfd017bc91c32cf644962ab7',1,'operator-(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabdaef661a90228ba7259c77122b9a03',1,'operator-(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e260d1cb3780fad10c72cadc0c49c0f',1,'operator-(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf94b2d97816dcd6619274fb4feeae0f5',1,'operator-(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2144e86d0a8c877122ccb1cbcfe55524',1,'operator-(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a39a0486a0d1f390b5f009cb61d18d9',1,'operator-(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcef7c7a90b8afae18f0e59c1e1ade46',1,'operator-(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8802eb31440714af8c5920c08a8fbaf8',1,'operator-(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf470cfb079490ca0efc9e425d8a23737',1,'operator-(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b0501a5e044aaf1b9138c442f2422c2',1,'operator-(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd60b5d630bd0b3ae6a4d8f53c5205',1,'operator-(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1c549d5b7cc2b71327ce10502f39db',1,'operator-(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99eba581458fcdf17f4e91d73459ce96',1,'operator-(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c920201791dc95f7e59f0a77524a4d9',1,'operator-(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf83e424e36e12a70fed05d67393f4fa9',1,'operator-(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga869ba8c0391f2954ec9b51b84e4cb037',1,'operator-(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286015c3a12eb08da7fee407884e7f35',1,'operator-(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadece9875b31689e0880c626826fa8a14',1,'operator-(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa095d5d102f9325c5700eb1fd989f69b',1,'operator-(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga835e06caee26a307b42ac4b6cae3eb36',1,'operator-(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f1f7629c16642fa581b16c2898a05ff',1,'operator-(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf868783fdecde414693bbcb9db17628e',1,'operator-(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga213848161d7be3d9c73dba5e709b079b',1,'operator-(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac118a8f2d822cd667b833e12a796be34',1,'operator-(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae51bb9b05a4f76f5c3a01cf3db5962',1,'operator-(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d855d60a702b3918c841a26570601a3',1,'operator-(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e27485d93087eacf685d1498e74f556',1,'operator-(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5d66d9588e722109b30fac960662e64',1,'operator-(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34688ab71722659850f777051315dc27',1,'operator-(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga557b681e893a841fe02f17a00d62eaa1',1,'operator-(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf80315d6f88dfcbcf02c76f8ee8f953c',1,'operator-(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa89552d0de95801c80b2bb3a5e6435d1',1,'operator-(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf23698f18f04d1250221e6746b4c9810',1,'operator-(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fd1d6f3e17ba35584f39da603e25c82',1,'operator-(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f33fccdd0d3fa940bd3f443b24f8d5',1,'operator-(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ceff4b71ebb6b58c8efdb4de80df7cb',1,'operator-(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236c690b63999f1e9f07c84fb1dedc5f',1,'operator-(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1094d7d71d2aefc1869c72347e53d09f',1,'operator-(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ce9e9e1c97e5f00df933988651acc3',1,'operator-(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga183b0f68b7e993cf1d10ce74cf656f63',1,'operator-(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c95d1121a4fd678e416dd219bc2eff2',1,'operator-(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2c1e422a17e927b9bc13516d09691ef',1,'operator-(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga377b580b41f8a05440b4a4298e79847c',1,'operator-(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbdfcaf718602ea178cefb40abc3199b',1,'operator-(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50daff19a60364c8d50211b6150f7bde',1,'operator-(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46d693e48f72432105a7694db15cb16b',1,'operator-(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c2a9c4da615af916d394e1357098827',1,'operator-(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa834729f3bf1a45f6bccba9dc8df5872',1,'operator-(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c42e1c911cd6ced910f9c7c39e6217',1,'operator-(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28c6d90fc518cd3304a57dfc88446779',1,'operator-(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07106a51535e185bcf711ed49575530d',1,'operator-(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4c9e88d426e7f6991f6e34b107f56cc',1,'operator-(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaab018c47cc4e8f0dfa471622a784677b',1,'std::operator-(const complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5c472f8066a2430d37e23f0c29c45718',1,'std::operator-(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9fb72f354a48fc4332fed44a47c562fd',1,'std::operator-(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga526ecc839bcebb2dbb970cee1d3de8d3',1,'std::operator-(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga9098fadcbe59e0ba2fa8590bd8388f5e',1,'std::tr2::operator-()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaab018c47cc4e8f0dfa471622a784677b',1,'operator-(const complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5c472f8066a2430d37e23f0c29c45718',1,'operator-(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9fb72f354a48fc4332fed44a47c562fd',1,'operator-(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga526ecc839bcebb2dbb970cee1d3de8d3',1,'operator-(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga9098fadcbe59e0ba2fa8590bd8388f5e',1,'operator-(const dynamic_bitset< _WordT, _Alloc > &__x, const dynamic_bitset< _WordT, _Alloc > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga028b49a6d0cf1f6afa48149603d953b2',1,'operator-() const(Global Namespace)']]], - ['operator_2d_2d_331',['operator--',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a792a43266d40b85aca7fd5ccce99a689',1,'cv::MatConstIterator::operator--()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a9ebb7e43682a724ce28d8715fc29a783',1,'cv::MatConstIterator::operator--(int)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#acd66a482fbc19586f2dfd47ebba6b448',1,'cv::MatConstIterator_::operator--()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ab07d8d0b89c903f779a021c2c97c8420',1,'cv::MatConstIterator_::operator--(int)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a7882f8680fe5a579a8cff9e77b876e34',1,'cv::MatIterator_::operator--()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#aacbd0bc9e0eccb76169a7bc3188527ad',1,'cv::MatIterator_::operator--(int)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a240e65582faf3f08a0cc9268063efdf0',1,'cv::SparseMatConstIterator::operator--()'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ae1e53a3cb951f9c3647c18e160fa124f',1,'cv::SparseMatConstIterator::operator--(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a013970df0401622fc82f1e3b4aafeb73',1,'std::reverse_iterator::operator--()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#ac7ab8ae9e2d74a1456d6d835e3de74e5',1,'std::reverse_iterator::operator--(int)']]], - ['operator_2d_3d_332',['operator-=',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a881e7011fee862380940bef019551dc6',1,'cv::MatConstIterator::operator-=()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#af05c490f19f8e10d3d81c7697e007e98',1,'cv::MatConstIterator_::operator-=()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ad0d1fe9aba83851f42462de9365268a2',1,'cv::MatIterator_::operator-=()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'cv::Matx::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'cv::Matx::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< _Tp, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< _Tp, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 1, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 1, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 2 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 2 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float_type, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float_type, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga27579376dfdbd8e4ffcdb7b3f0b7efe8',1,'cv::softdouble::operator-=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga855ef9ba871cb9fb4c2f7034966af711',1,'cv::softfloat::operator-=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'cv::Vec::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'cv::Vec::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< _Tp, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< _Tp, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a6e9d5332bf641e4bebfc4d94b407bfd0',1,'std::complex::operator-=(const _Tp &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaacea589517bdac6f85963e345f09ee17',1,'std::complex::operator-=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#af98737e3474e12ecb9d40f19bea2ea9e',1,'std::fpos::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac25a53dfa03677767990c5a3af186cf8',1,'std::gslice_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8eb0f010a6a61d5066af1b3e757b87b9',1,'std::indirect_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7e8b4e636a4ccb6a93f289308d2d6c7e',1,'std::mask_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a194e833ea2d84161f1bf3f996d1d1d5f',1,'std::reverse_iterator::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaaa8967e72a60fc2b6f8f422dc970ea1f',1,'std::slice_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a821d3b176095151a3557a0aa6f7871e4',1,'std::tr2::dynamic_bitset::operator-=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a821d3b176095151a3557a0aa6f7871e4',1,'std::tr2::dynamic_bitset::operator-=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4667f35667105d1ec1aa3e763c503cd4',1,'std::valarray::operator-=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e7ec75f9c2dd61177a35d939ce85f11',1,'std::valarray::operator-=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4667f35667105d1ec1aa3e763c503cd4',1,'valarray< size_t >::operator-=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e7ec75f9c2dd61177a35d939ce85f11',1,'valarray< size_t >::operator-=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#aac76a5e5e735b97f955189825cef7e2c',1,'Eigen::ArrayBase::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#aac76a5e5e735b97f955189825cef7e2c',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1042124b0ddee66e78ac7b0a9ac4cc9c',1,'Eigen::MatrixBase::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1042124b0ddee66e78ac7b0a9ac4cc9c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1042124b0ddee66e78ac7b0a9ac4cc9c',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a79ff0326cd78da5bb2bdc4a88f5428c9',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'Eigen::VectorwiseOp::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Derived, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Derived, Vertical >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator-=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gad5ad464e467385af9b4183e1689fa720',1,'cv::operator-=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga855ef9ba871cb9fb4c2f7034966af711',1,'operator-=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga27579376dfdbd8e4ffcdb7b3f0b7efe8',1,'operator-=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gad5ad464e467385af9b4183e1689fa720',1,'operator-=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaacea589517bdac6f85963e345f09ee17',1,'operator-=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac25a53dfa03677767990c5a3af186cf8',1,'operator-=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4667f35667105d1ec1aa3e763c503cd4',1,'operator-=(const _Tp &)(Global Namespace)']]], - ['operator_2d_3e_333',['operator->',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#af9c384816f316388b844f764d50c5ef7',1,'cv::util::optional::operator->()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a656e8f03c9c93365ad168cc141682658',1,'cv::util::optional::operator->() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#afff5687d9255ad33daa6780dda27b6c5',1,'__gnu_debug::_Safe_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a4789f11d5d5c248e478a79f590186f1a',1,'__gnu_debug::_Safe_local_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a60137368e9df33aaca43271c842f0dea',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a60137368e9df33aaca43271c842f0dea',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a2096ba7f4be3c22e0f883172ba323f5c',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a2096ba7f4be3c22e0f883172ba323f5c',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#afff5687d9255ad33daa6780dda27b6c5',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#afff5687d9255ad33daa6780dda27b6c5',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a4f35a84ace173bc8b49e7b15af544bdc',1,'const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#ab0ed1f338073d1926501cc11769724d9',1,'iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a4f35a84ace173bc8b49e7b15af544bdc',1,'point_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a281f49eca5033b2d2bd3c5f369bdb9e0',1,'point_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a26129c2150ef03c1d8d33a3bbe65ef23',1,'std::auto_ptr::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#acff5a9bfb1ef4383f413ea2cc8f6ef7d',1,'std::regex_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#aec95fbb6d9ff5cca02e86c2f8bdd3de9',1,'std::regex_token_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#ab256f3da0cdc3212fd9f676e70fcfa74',1,'std::reverse_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'std::unique_ptr::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Codecvt >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Res_type >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Result< _Res > >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Result_base >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< bool[]>::operator->()']]], - ['operator_2f_334',['operator/',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4fd7c94c36187ae1dd810e5e1cb98506',1,'cv::MatExpr::operator/(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9f4860191ebc911882258adb3ed81220',1,'cv::MatExpr::operator/(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7d490d89368ae09a8034d3ef145f1b75',1,'cv::MatExpr::operator/(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6f76b7cbb9b728896ffb90522796a1c7',1,'cv::MatExpr::operator/(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27472a7b10eb061860f2d44e91ce2016',1,'cv::MatExpr::operator/(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aa27acc5fc0baa71648720825da8d7c8d',1,'cv::MatExpr::operator/(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af1c42ad483f7b6947e17db0c508c4292',1,'cv::MatExpr::operator/(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a296be1bafb9c82f8fd4ec55ea5f3ef81',1,'cv::MatExpr::operator/(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af0227aa2a8b2fb11495e9efc2ce8a9b6',1,'cv::MatExpr::operator/(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a86f61f74c4c8c305218ab7f6e1ad7f87',1,'cv::MatExpr::operator/(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4fd7c94c36187ae1dd810e5e1cb98506',1,'cv::MatExpr::operator/(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9f4860191ebc911882258adb3ed81220',1,'cv::MatExpr::operator/(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7d490d89368ae09a8034d3ef145f1b75',1,'cv::MatExpr::operator/(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6f76b7cbb9b728896ffb90522796a1c7',1,'cv::MatExpr::operator/(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27472a7b10eb061860f2d44e91ce2016',1,'cv::MatExpr::operator/(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aa27acc5fc0baa71648720825da8d7c8d',1,'cv::MatExpr::operator/(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af1c42ad483f7b6947e17db0c508c4292',1,'cv::MatExpr::operator/(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a296be1bafb9c82f8fd4ec55ea5f3ef81',1,'cv::MatExpr::operator/(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af0227aa2a8b2fb11495e9efc2ce8a9b6',1,'cv::MatExpr::operator/(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a86f61f74c4c8c305218ab7f6e1ad7f87',1,'cv::MatExpr::operator/(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga995d0eb099efa09893b36adecda4243a',1,'cv::softdouble::operator/()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaad5d6d10fa57557f159b67b9618bf557',1,'cv::softfloat::operator/()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'Eigen::VectorwiseOp::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Derived, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Derived, Vertical >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator/()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a90a11fe6c7f37b1746a3ff9cb24b0d53.html#a90a11fe6c7f37b1746a3ff9cb24b0d53',1,'nlohmann::json_pointer::operator/'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_af5a4bc4f82113c271c9a0cd4d3b5f31c.html#af5a4bc4f82113c271c9a0cd4d3b5f31c',1,'nlohmann::json_pointer::operator/'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a926c9065dbed1bedc17857a813f7a46f.html#a926c9065dbed1bedc17857a813f7a46f',1,'nlohmann::json_pointer::operator/'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga73e22cc4b1f8a3132abc30677ed531c4',1,'cv::operator/()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63c10edfae5414877b679eeb58c9f4a7',1,'cv::cudev::operator/(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2abad8ee149156b1c5538b6fc541638',1,'cv::cudev::operator/(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1a1c4ccd594dd41d946649a7ab1ca3',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfba9463c82a223ac76103d9bcf16aa0',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1782e839b0d1c68438dbecfcac2820ac',1,'cv::cudev::operator/(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabaec01b86941bbff223af9d2c29e68bc',1,'cv::cudev::operator/(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0f36028b3f87632fbadae1cf5f2d03',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8314510e1d4316367ac391f110059454',1,'cv::cudev::operator/(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9036097b144dbf93817c5ef126d116d0',1,'cv::cudev::operator/(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8db65d14cd813f8d457b921c39bb27a8',1,'cv::cudev::operator/(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c6b1c78bd2dbea3ea062235736e7329',1,'cv::cudev::operator/(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d4687efb816dcbc5a403deef46acdb',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3bfcae1affcdf5e57f963f93722a04c3',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa73d74035bcb8e99515b0e082068845',1,'cv::cudev::operator/(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26c9c7aac034c3c77d2c7fcafb2b7324',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b20a16f030f203ca1246b182ee58fd5',1,'cv::cudev::operator/(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89c3f0a954a006a68c412300414e17de',1,'cv::cudev::operator/(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520991356f52a0254059d9542c16006',1,'cv::cudev::operator/(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ef2415aa67752f6a252d4f7d068a526',1,'cv::cudev::operator/(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68da45fdf82b957dbb2cf14a027c0322',1,'cv::cudev::operator/(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67a4465bc93192a57e10555bccc96bda',1,'cv::cudev::operator/(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga906b0deabff7997bb4d80ae166a137c3',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a7b51f10d165feaae86cd0bc18e91e1',1,'cv::cudev::operator/(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a6cbf801c763c54dbd07832815194bd',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52e5285f48a908e86ff891aed2d743f2',1,'cv::cudev::operator/(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a2a30fd3e15d27a99f3b7d1917f9e38',1,'cv::cudev::operator/(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga624a50622e8a386f768ef3190ef08ba8',1,'cv::cudev::operator/(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac63ba9fe41878226447c261efbb516c1',1,'cv::cudev::operator/(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga436022693ffe3e23663fa33b1512e777',1,'cv::cudev::operator/(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5877c60845ecd0eb7145b119e6513b55',1,'cv::cudev::operator/(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ef3fffb48e92a7a50f3851c5fb7338b',1,'cv::cudev::operator/(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad520b1c01bd7118c82548f6cb020238f',1,'cv::cudev::operator/(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae93cb2fb69f84957b45190513bc4ac38',1,'cv::cudev::operator/(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadff98c44d9758083f04c7eee4e7d5a3e',1,'cv::cudev::operator/(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga549d0f141917aec8ef972c77971c1084',1,'cv::cudev::operator/(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508053e4393ce90846ce4974907d317a',1,'cv::cudev::operator/(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga583198460ba33f63a71a030fb51ea4ec',1,'cv::cudev::operator/(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a8182f4c0412f05ec96d4f734619f65',1,'cv::cudev::operator/(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae209c1b38d254292bf2ff0ca617d96bd',1,'cv::cudev::operator/(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7ce642e9cb3aad8237b74e57545ec0',1,'cv::cudev::operator/(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc358c56da85f1e9fb45ec4379aef819',1,'cv::cudev::operator/(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37633241bee5b78408d690bea4d6bc97',1,'cv::cudev::operator/(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182216df7f15de3724ac89de6dbbdc08',1,'cv::cudev::operator/(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24d234d3496e5365fcc0181c864bee8f',1,'cv::cudev::operator/(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84226e77b868bda78abaa855e431f83b',1,'cv::cudev::operator/(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5065b677cee6eaf61c4990fab2fef59b',1,'cv::cudev::operator/(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45b4e9375b6e30685cc40474d84ccf02',1,'cv::cudev::operator/(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2025f63f3d90e41dec633bedd58357e',1,'cv::cudev::operator/(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86d40a00cbb232d5d72ba19ec81ed438',1,'cv::cudev::operator/(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc622e639c83e90f061aea4d908af53',1,'cv::cudev::operator/(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8126bd6f60da8d7fcb39cb6abd253bdc',1,'cv::cudev::operator/(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae06070c3075afe5424512508edb81586',1,'cv::cudev::operator/(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga460f926abfd82d2b3f91e886ee6d6aa4',1,'cv::cudev::operator/(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19e6a6945b5af142801ced01b619f993',1,'cv::cudev::operator/(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaade20eaaba20908f19ea46982534d36f',1,'cv::cudev::operator/(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d97c6ab31477097c28510e7b449979f',1,'cv::cudev::operator/(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07c8153666fa828bf51ba1df3d037641',1,'cv::cudev::operator/(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace9317803db502fe7a302c33e81fde41',1,'cv::cudev::operator/(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04b6dbca2658111aa32e4b32f88e3d29',1,'cv::cudev::operator/(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb7d476559b303db2472d6effecb2f89',1,'cv::cudev::operator/(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab32e30453cfc72ff1b0aa78c8a1b2d',1,'cv::cudev::operator/(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfda695bfc877ea25dbf96d5b554676',1,'cv::cudev::operator/(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3addc09f491a734516e0b7dd2b44179',1,'cv::cudev::operator/(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a4539fab45842a06a5edecc85beb00',1,'cv::cudev::operator/(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad727324599c518090bdfccf7b8e08c22',1,'cv::cudev::operator/(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5db301a86ed3528e1ae4d332a6f30fd2',1,'cv::cudev::operator/(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53358badb500dfd70e070cf1ebfd0a18',1,'cv::cudev::operator/(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56dffbd26015a50c0bc5aa6ebb742c31',1,'cv::cudev::operator/(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac92b8e55ec04f04b2c031123d997c266',1,'cv::cudev::operator/(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987dcefef0b62d8bc37af554235fe0ef',1,'cv::cudev::operator/(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab67eafd771d2282a502fdbd6c54ead06',1,'cv::cudev::operator/(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ab843a5f0b70aad934d6c3e5c5b8257',1,'cv::cudev::operator/(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga947ed5817156d062129c8903c0603e95',1,'cv::cudev::operator/(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5eed4cb9d49becaa49611f544539d206',1,'cv::cudev::operator/(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05241f798415de42c5da5c69c55aef11',1,'cv::cudev::operator/(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf24592373ca8cb6278d42bd53e8184a',1,'cv::cudev::operator/(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99f77817f5ca8058516194a9dd63c283',1,'cv::cudev::operator/(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed1bde145568955c9f1131d91a4e0614',1,'cv::cudev::operator/(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cc5fea7eec39d991a9bca1c5d65f450',1,'cv::cudev::operator/(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2564bcebc93bb19ad1ef13ad520ed4d',1,'cv::cudev::operator/(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6829aff16fde91d0e7465d0fb6e62913',1,'cv::cudev::operator/(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50208cff6a446a4b35ac2f8688eebce0',1,'cv::cudev::operator/(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa97fbcd1bc2ad1f58b02b567645c9d61',1,'cv::cudev::operator/(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga816379a4f078d68b1c4c351dad009189',1,'cv::cudev::operator/(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabef9e42d02bba8884bfad5fbe70bbada',1,'cv::cudev::operator/(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17a0b78772e84b3e73b6890b49d340e1',1,'cv::cudev::operator/(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga794491c37dd2df850f3893138414353a',1,'cv::cudev::operator/(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b08fc0b7dbd5277deb26cdc85008b2d',1,'cv::cudev::operator/(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b04679db179bda54f1e9d0d2673ffc4',1,'cv::cudev::operator/(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8034cd977168fcbeb64d0f143c27dd6c',1,'cv::cudev::operator/(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad760f8b985f9f78e6f7cfae125c57952',1,'cv::cudev::operator/(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab37aec5734a505aa76159bb43f68a636',1,'cv::cudev::operator/(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c116242125c2ea7d6aaef804c309757',1,'cv::cudev::operator/(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ba61529ddd1ed3f0329c56b834999a1',1,'cv::cudev::operator/(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga113d7371aab51f681e1e5e82d268c3ee',1,'cv::cudev::operator/(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65207a98a6ba24f91f6d735a88c4ae11',1,'cv::cudev::operator/(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4cab124d95ea36b40f41915cb6c52e',1,'cv::cudev::operator/(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c0325622303ec37f5a35fdb5acb4aba',1,'cv::cudev::operator/(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51668d8071ec45f300736c84386a95de',1,'cv::cudev::operator/(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ba06691317169f995b1e4f84af326f',1,'cv::cudev::operator/(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cd026898af4d75be94752d39ea86285',1,'cv::cudev::operator/(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f6d00516b5705d5b0bfe98574781f29',1,'cv::cudev::operator/(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf2e26c94589161b5aa1ff904b3d91c1',1,'cv::cudev::operator/(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1fd8b99c66de2ff572d583fd379f9a3',1,'cv::cudev::operator/(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga941fdc20547d924ada48cfb0e59957c2',1,'cv::cudev::operator/(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147f7c5b249d5eec2f5edbe9d663f023',1,'cv::cudev::operator/(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a2f63e1448c1423a462cb3802dbc1fc',1,'cv::cudev::operator/(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f9f5d4955d4910a88edc28d264773a',1,'cv::cudev::operator/(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788722f37dc7eedf7369be91a27b2baf',1,'cv::cudev::operator/(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0784968a2beace1b43d5bfcad6895bf8',1,'cv::cudev::operator/(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4107f0212b5bd97903dbc0fd113a55bd',1,'cv::cudev::operator/(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f7aee12ad93a7ddeb22a39e77fbb649',1,'cv::cudev::operator/(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86164b5b800cbf1a1bc1da69dc6b1cea',1,'cv::cudev::operator/(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffb8f750584cbf3428cca25579fa9e0e',1,'cv::cudev::operator/(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddffd612d0a062ab2c7c63f809d32103',1,'cv::cudev::operator/(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8efa47e085c080af09f59676bce38003',1,'cv::cudev::operator/(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3701eb47de8686f78f358575ee69eab',1,'cv::cudev::operator/(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4996cdd2cf5b7d7f88201b3280b9b882',1,'cv::cudev::operator/(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efd1425a4f37f08505df7138be39786',1,'cv::cudev::operator/(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb65bc0269df370c51277a668fcdcc73',1,'cv::cudev::operator/(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa92a62d328a8ab3e85e80b52693d156c',1,'cv::cudev::operator/(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72f5c3ec2dbedb3f1150559435cb430b',1,'cv::cudev::operator/(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391153a0840528f075a6fc407e841c10',1,'cv::cudev::operator/(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadeb192837562e5c4b8d82f8ab38bf084',1,'cv::cudev::operator/(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2f238b633143c3e6b22b2b8579c53e',1,'cv::cudev::operator/(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f1ef76972820abe1d3a3ae91e95de4',1,'cv::cudev::operator/(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15fa7ad89e9bafc4993276448a0d3bd5',1,'cv::cudev::operator/(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab15f13356b2c04e4c2c4cebdcf6e4b',1,'cv::cudev::operator/(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafae9c481f30b10a2c900bf4a4da08af8',1,'cv::cudev::operator/(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7ca775d4ec4865729ecdc345dab1e30',1,'cv::cudev::operator/(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade1df8d73b8ac8fb3fd2fb853a0c187a',1,'cv::cudev::operator/(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe8737c01957c40118140eec1bf68d9',1,'cv::cudev::operator/(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6c52b2d2d236023ea59691301f17cc',1,'cv::cudev::operator/(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8435aa501c96247ea59d3ea8b947117e',1,'cv::cudev::operator/(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga828cee39fcbf51a1644d44510c12b7b4',1,'cv::cudev::operator/(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c5f0b61d269ea3a00f58a1b80b09aa5',1,'cv::cudev::operator/(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94a4aa6688bbf6fb5dbe16962cf49041',1,'cv::cudev::operator/(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ac2bcd0e1c58eabcbba3caa878be93f',1,'cv::cudev::operator/(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fccb24eadfc89075e1380c4a840226d',1,'cv::cudev::operator/(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f329583283b38d835e5111baa0e9ccb',1,'cv::cudev::operator/(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac224098894c2dd93c45d36ce0aa2d8f0',1,'cv::cudev::operator/(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf34d47c8fc399c1b5633a81e0a2a20aa',1,'cv::cudev::operator/(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64c7907250e45a962209e2c4c8e3860d',1,'cv::cudev::operator/(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1db39b81ceb79ce30d5ff502387a0172',1,'cv::cudev::operator/(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e6457d8d8908556e5a6623bca43f0d5',1,'cv::cudev::operator/(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22b5c96ff38d1d48b10aabad0e49be7b',1,'cv::cudev::operator/(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdf50d97f13cd4161262f9f7152c936c',1,'cv::cudev::operator/(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga317fc707d6c32eb0344e606c409cd502',1,'cv::cudev::operator/(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0dd8315bf86df24af59d7a26804f4af3',1,'cv::cudev::operator/(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca9088b2f5335ee8214a1dfbc42fd1d',1,'cv::cudev::operator/(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1aaea7b03c2dff6baf65f0054823b44',1,'cv::cudev::operator/(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49c5598a8d2bcf1957abd74da1c06936',1,'cv::cudev::operator/(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d4fa53f21d88b5d9fa07222b90ee3c',1,'cv::cudev::operator/(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c71abb3cec3af512f67e4b7134f4870',1,'cv::cudev::operator/(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9763eb69ace36e922bdc23adf58fa071',1,'cv::cudev::operator/(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6426caf4d84767c4f4b4df77b4bd8f7',1,'cv::cudev::operator/(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b4c3fadce268d79da7c2e33e1aa8ac',1,'cv::cudev::operator/(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fda9fbfd0224f6806547e77bbc9bbec',1,'cv::cudev::operator/(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c9e4aecc482aeae0ebd4fc37b1efd7',1,'cv::cudev::operator/(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeffd81f4b90d5e1fb4f7d8658d595a73',1,'cv::cudev::operator/(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae885e6e18ed764df65cc712846fbcf82',1,'cv::cudev::operator/(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e271106bb16c64506b78f50599ffad0',1,'cv::cudev::operator/(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2af76884f887a6bae64783d7cfa3fd5',1,'cv::cudev::operator/(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga216608449d27058bfa3427d67089019b',1,'cv::cudev::operator/(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85aa004a5cb3b6108b0041ad11574367',1,'cv::cudev::operator/(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a42711792e9b1ed79c25959954adc',1,'cv::cudev::operator/(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04cb7fa059a6bfa8de34114ccb829475',1,'cv::cudev::operator/(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5c764c78ba7fc0170c586345d67cf82',1,'cv::cudev::operator/(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac28d28065b478079ccf4706cb328ad52',1,'cv::cudev::operator/(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8722a51ca67c9eac25f2896535e5543d',1,'cv::cudev::operator/(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd7e6744dedace2790dda951604c16f4',1,'cv::cudev::operator/(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac20d96aa5d9bc6828f580d98be9b274b',1,'cv::cudev::operator/(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e16dd1de3cc6cdaa3e01b991cf1877',1,'cv::cudev::operator/(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d2ad56cb9b7935755ab98989621744',1,'cv::cudev::operator/(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d36cf520a15e02c4639cf09d13638af',1,'cv::cudev::operator/(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae910a0177b6e5954def12c3e1ceb7889',1,'cv::cudev::operator/(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4b24fae841ff37f46b2f184e4214f49',1,'cv::cudev::operator/(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9fb15ffc426038614898e8cf6f5245',1,'cv::cudev::operator/(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad380b25d2ba11d6de6db82c39052900e',1,'cv::cudev::operator/(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b3207d6bf2685058ea4e895ac25c678',1,'cv::cudev::operator/(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15293a946d5146fd48c04f46b2b81845',1,'cv::cudev::operator/(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca80d86a8a80d0a596b3c5abdc0f5b7',1,'cv::cudev::operator/(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed6a240c984f95a345129f96274a9cfe',1,'cv::cudev::operator/(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9f5801f25493f31c7f636c3df933b99',1,'cv::cudev::operator/(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae74b42fba92a1278d5d20a37ff25668c',1,'cv::cudev::operator/(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21b3dbd89341fa3f444ea21ef6e0b2f5',1,'cv::cudev::operator/(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87509bef25c897cac8532e466e4d66a7',1,'cv::cudev::operator/(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6653c9349dcc4767667164b9c45ecc4f',1,'cv::cudev::operator/(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfbe8b6a853d911c6caa057249a2f3c2',1,'cv::cudev::operator/(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac53ae2c9994299b79543fd5d25284a85',1,'cv::cudev::operator/(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a5e479a1745b53490f2c08b0993c0e5',1,'cv::cudev::operator/(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f5210161d628f2d4e696f26fac33d7',1,'cv::cudev::operator/(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf75713de0f2b797667bb783913812cf5',1,'cv::cudev::operator/(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b57e7742e16dc732c96c86c7a25a7d',1,'cv::cudev::operator/(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53df6d0915ba0492a653459ccb61dd1e',1,'cv::cudev::operator/(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca76e1c82d8c8fa487273dd5488b5afc',1,'cv::cudev::operator/(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff3491be4e1aeb2d4b2ecfafac25bfc',1,'cv::cudev::operator/(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae20c5ffaf5dc093b018dbb2c623a4a9d',1,'cv::cudev::operator/(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga294bb78feefcf2213a99e3765bfcd590',1,'cv::cudev::operator/(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f4874876e654be2d30711f55ba67bb9',1,'cv::cudev::operator/(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931b2f3f4067c776bc79fa993f307479',1,'cv::cudev::operator/(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b00fe8b4c36cb662c4528caced6e021',1,'cv::cudev::operator/(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dd0224214d0591a4644c9fa753c613',1,'cv::cudev::operator/(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d8b0d5eb5f540043139d7077cd89acd',1,'cv::cudev::operator/(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa14eb5e414191a5110c9657940f4911f',1,'cv::cudev::operator/(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845184957965ee09b2c75d19b3c943b8',1,'cv::cudev::operator/(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98436d248883059f3789b0d0ee05623',1,'cv::cudev::operator/(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae36ded72b3f6a63e66bf8e6bedcd1246',1,'cv::cudev::operator/(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f5082bc85c86de08b2e0f479411caec',1,'cv::cudev::operator/(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d17e190d57f7cbaa40be123e2a51224',1,'cv::cudev::operator/(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41a157235e0cf757bb61bdf97c135a56',1,'cv::cudev::operator/(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5738156055f71a2394da2fd9986e73',1,'cv::cudev::operator/(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cbd3ba36dcb1399c0cebe931b575705',1,'cv::cudev::operator/(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71437398c247ffa7ef5ced05aa8c32fd',1,'cv::cudev::operator/(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca86550e3139b130209e6a73f8e288c',1,'cv::cudev::operator/(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a9725a2048b27de8e5b4b7a962b7a45',1,'cv::cudev::operator/(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga263e8628015d84cc51979ad5d9fab4dd',1,'cv::cudev::operator/(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3618b8f1c4483be2b49784692b55da93',1,'cv::cudev::operator/(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56abdc374d21db3f6d3a4750a60b46d4',1,'cv::cudev::operator/(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga964f4c517e631519f06210ca6e00a505',1,'cv::cudev::operator/(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7785eabab48b5412e4bec4c5ff9a221d',1,'cv::cudev::operator/(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga985d99669358177e1081cd19cea4fb7a',1,'cv::cudev::operator/(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ae6065edefcba07b4aab58590e4414',1,'cv::cudev::operator/(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8820b8c1e646e150d78c6c23192d99bc',1,'cv::cudev::operator/(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaad5d6d10fa57557f159b67b9618bf557',1,'operator/(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga995d0eb099efa09893b36adecda4243a',1,'operator/(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga73e22cc4b1f8a3132abc30677ed531c4',1,'operator/(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63c10edfae5414877b679eeb58c9f4a7',1,'operator/(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2abad8ee149156b1c5538b6fc541638',1,'operator/(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1a1c4ccd594dd41d946649a7ab1ca3',1,'operator/(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfba9463c82a223ac76103d9bcf16aa0',1,'operator/(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1782e839b0d1c68438dbecfcac2820ac',1,'operator/(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabaec01b86941bbff223af9d2c29e68bc',1,'operator/(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0f36028b3f87632fbadae1cf5f2d03',1,'operator/(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8314510e1d4316367ac391f110059454',1,'operator/(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9036097b144dbf93817c5ef126d116d0',1,'operator/(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8db65d14cd813f8d457b921c39bb27a8',1,'operator/(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c6b1c78bd2dbea3ea062235736e7329',1,'operator/(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d4687efb816dcbc5a403deef46acdb',1,'operator/(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3bfcae1affcdf5e57f963f93722a04c3',1,'operator/(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa73d74035bcb8e99515b0e082068845',1,'operator/(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26c9c7aac034c3c77d2c7fcafb2b7324',1,'operator/(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b20a16f030f203ca1246b182ee58fd5',1,'operator/(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89c3f0a954a006a68c412300414e17de',1,'operator/(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520991356f52a0254059d9542c16006',1,'operator/(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ef2415aa67752f6a252d4f7d068a526',1,'operator/(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68da45fdf82b957dbb2cf14a027c0322',1,'operator/(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67a4465bc93192a57e10555bccc96bda',1,'operator/(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga906b0deabff7997bb4d80ae166a137c3',1,'operator/(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a7b51f10d165feaae86cd0bc18e91e1',1,'operator/(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a6cbf801c763c54dbd07832815194bd',1,'operator/(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52e5285f48a908e86ff891aed2d743f2',1,'operator/(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a2a30fd3e15d27a99f3b7d1917f9e38',1,'operator/(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga624a50622e8a386f768ef3190ef08ba8',1,'operator/(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac63ba9fe41878226447c261efbb516c1',1,'operator/(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga436022693ffe3e23663fa33b1512e777',1,'operator/(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5877c60845ecd0eb7145b119e6513b55',1,'operator/(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ef3fffb48e92a7a50f3851c5fb7338b',1,'operator/(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad520b1c01bd7118c82548f6cb020238f',1,'operator/(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae93cb2fb69f84957b45190513bc4ac38',1,'operator/(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadff98c44d9758083f04c7eee4e7d5a3e',1,'operator/(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga549d0f141917aec8ef972c77971c1084',1,'operator/(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508053e4393ce90846ce4974907d317a',1,'operator/(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga583198460ba33f63a71a030fb51ea4ec',1,'operator/(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a8182f4c0412f05ec96d4f734619f65',1,'operator/(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae209c1b38d254292bf2ff0ca617d96bd',1,'operator/(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7ce642e9cb3aad8237b74e57545ec0',1,'operator/(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc358c56da85f1e9fb45ec4379aef819',1,'operator/(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37633241bee5b78408d690bea4d6bc97',1,'operator/(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182216df7f15de3724ac89de6dbbdc08',1,'operator/(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24d234d3496e5365fcc0181c864bee8f',1,'operator/(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84226e77b868bda78abaa855e431f83b',1,'operator/(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5065b677cee6eaf61c4990fab2fef59b',1,'operator/(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45b4e9375b6e30685cc40474d84ccf02',1,'operator/(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2025f63f3d90e41dec633bedd58357e',1,'operator/(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86d40a00cbb232d5d72ba19ec81ed438',1,'operator/(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc622e639c83e90f061aea4d908af53',1,'operator/(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8126bd6f60da8d7fcb39cb6abd253bdc',1,'operator/(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae06070c3075afe5424512508edb81586',1,'operator/(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga460f926abfd82d2b3f91e886ee6d6aa4',1,'operator/(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19e6a6945b5af142801ced01b619f993',1,'operator/(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaade20eaaba20908f19ea46982534d36f',1,'operator/(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d97c6ab31477097c28510e7b449979f',1,'operator/(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07c8153666fa828bf51ba1df3d037641',1,'operator/(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace9317803db502fe7a302c33e81fde41',1,'operator/(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04b6dbca2658111aa32e4b32f88e3d29',1,'operator/(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb7d476559b303db2472d6effecb2f89',1,'operator/(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab32e30453cfc72ff1b0aa78c8a1b2d',1,'operator/(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfda695bfc877ea25dbf96d5b554676',1,'operator/(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3addc09f491a734516e0b7dd2b44179',1,'operator/(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a4539fab45842a06a5edecc85beb00',1,'operator/(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad727324599c518090bdfccf7b8e08c22',1,'operator/(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5db301a86ed3528e1ae4d332a6f30fd2',1,'operator/(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53358badb500dfd70e070cf1ebfd0a18',1,'operator/(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56dffbd26015a50c0bc5aa6ebb742c31',1,'operator/(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac92b8e55ec04f04b2c031123d997c266',1,'operator/(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987dcefef0b62d8bc37af554235fe0ef',1,'operator/(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab67eafd771d2282a502fdbd6c54ead06',1,'operator/(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ab843a5f0b70aad934d6c3e5c5b8257',1,'operator/(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga947ed5817156d062129c8903c0603e95',1,'operator/(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5eed4cb9d49becaa49611f544539d206',1,'operator/(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05241f798415de42c5da5c69c55aef11',1,'operator/(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf24592373ca8cb6278d42bd53e8184a',1,'operator/(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99f77817f5ca8058516194a9dd63c283',1,'operator/(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed1bde145568955c9f1131d91a4e0614',1,'operator/(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cc5fea7eec39d991a9bca1c5d65f450',1,'operator/(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2564bcebc93bb19ad1ef13ad520ed4d',1,'operator/(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6829aff16fde91d0e7465d0fb6e62913',1,'operator/(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50208cff6a446a4b35ac2f8688eebce0',1,'operator/(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa97fbcd1bc2ad1f58b02b567645c9d61',1,'operator/(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga816379a4f078d68b1c4c351dad009189',1,'operator/(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabef9e42d02bba8884bfad5fbe70bbada',1,'operator/(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17a0b78772e84b3e73b6890b49d340e1',1,'operator/(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga794491c37dd2df850f3893138414353a',1,'operator/(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b08fc0b7dbd5277deb26cdc85008b2d',1,'operator/(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b04679db179bda54f1e9d0d2673ffc4',1,'operator/(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8034cd977168fcbeb64d0f143c27dd6c',1,'operator/(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad760f8b985f9f78e6f7cfae125c57952',1,'operator/(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab37aec5734a505aa76159bb43f68a636',1,'operator/(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c116242125c2ea7d6aaef804c309757',1,'operator/(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ba61529ddd1ed3f0329c56b834999a1',1,'operator/(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga113d7371aab51f681e1e5e82d268c3ee',1,'operator/(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65207a98a6ba24f91f6d735a88c4ae11',1,'operator/(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4cab124d95ea36b40f41915cb6c52e',1,'operator/(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c0325622303ec37f5a35fdb5acb4aba',1,'operator/(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51668d8071ec45f300736c84386a95de',1,'operator/(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ba06691317169f995b1e4f84af326f',1,'operator/(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cd026898af4d75be94752d39ea86285',1,'operator/(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f6d00516b5705d5b0bfe98574781f29',1,'operator/(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf2e26c94589161b5aa1ff904b3d91c1',1,'operator/(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1fd8b99c66de2ff572d583fd379f9a3',1,'operator/(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga941fdc20547d924ada48cfb0e59957c2',1,'operator/(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147f7c5b249d5eec2f5edbe9d663f023',1,'operator/(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a2f63e1448c1423a462cb3802dbc1fc',1,'operator/(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f9f5d4955d4910a88edc28d264773a',1,'operator/(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788722f37dc7eedf7369be91a27b2baf',1,'operator/(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0784968a2beace1b43d5bfcad6895bf8',1,'operator/(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4107f0212b5bd97903dbc0fd113a55bd',1,'operator/(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f7aee12ad93a7ddeb22a39e77fbb649',1,'operator/(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86164b5b800cbf1a1bc1da69dc6b1cea',1,'operator/(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffb8f750584cbf3428cca25579fa9e0e',1,'operator/(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddffd612d0a062ab2c7c63f809d32103',1,'operator/(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8efa47e085c080af09f59676bce38003',1,'operator/(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3701eb47de8686f78f358575ee69eab',1,'operator/(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4996cdd2cf5b7d7f88201b3280b9b882',1,'operator/(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efd1425a4f37f08505df7138be39786',1,'operator/(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb65bc0269df370c51277a668fcdcc73',1,'operator/(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa92a62d328a8ab3e85e80b52693d156c',1,'operator/(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72f5c3ec2dbedb3f1150559435cb430b',1,'operator/(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391153a0840528f075a6fc407e841c10',1,'operator/(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadeb192837562e5c4b8d82f8ab38bf084',1,'operator/(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2f238b633143c3e6b22b2b8579c53e',1,'operator/(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f1ef76972820abe1d3a3ae91e95de4',1,'operator/(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15fa7ad89e9bafc4993276448a0d3bd5',1,'operator/(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab15f13356b2c04e4c2c4cebdcf6e4b',1,'operator/(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafae9c481f30b10a2c900bf4a4da08af8',1,'operator/(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7ca775d4ec4865729ecdc345dab1e30',1,'operator/(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade1df8d73b8ac8fb3fd2fb853a0c187a',1,'operator/(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe8737c01957c40118140eec1bf68d9',1,'operator/(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6c52b2d2d236023ea59691301f17cc',1,'operator/(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8435aa501c96247ea59d3ea8b947117e',1,'operator/(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga828cee39fcbf51a1644d44510c12b7b4',1,'operator/(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c5f0b61d269ea3a00f58a1b80b09aa5',1,'operator/(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94a4aa6688bbf6fb5dbe16962cf49041',1,'operator/(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ac2bcd0e1c58eabcbba3caa878be93f',1,'operator/(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fccb24eadfc89075e1380c4a840226d',1,'operator/(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f329583283b38d835e5111baa0e9ccb',1,'operator/(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac224098894c2dd93c45d36ce0aa2d8f0',1,'operator/(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf34d47c8fc399c1b5633a81e0a2a20aa',1,'operator/(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64c7907250e45a962209e2c4c8e3860d',1,'operator/(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1db39b81ceb79ce30d5ff502387a0172',1,'operator/(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e6457d8d8908556e5a6623bca43f0d5',1,'operator/(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22b5c96ff38d1d48b10aabad0e49be7b',1,'operator/(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdf50d97f13cd4161262f9f7152c936c',1,'operator/(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga317fc707d6c32eb0344e606c409cd502',1,'operator/(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0dd8315bf86df24af59d7a26804f4af3',1,'operator/(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca9088b2f5335ee8214a1dfbc42fd1d',1,'operator/(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1aaea7b03c2dff6baf65f0054823b44',1,'operator/(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49c5598a8d2bcf1957abd74da1c06936',1,'operator/(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d4fa53f21d88b5d9fa07222b90ee3c',1,'operator/(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c71abb3cec3af512f67e4b7134f4870',1,'operator/(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9763eb69ace36e922bdc23adf58fa071',1,'operator/(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6426caf4d84767c4f4b4df77b4bd8f7',1,'operator/(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b4c3fadce268d79da7c2e33e1aa8ac',1,'operator/(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fda9fbfd0224f6806547e77bbc9bbec',1,'operator/(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c9e4aecc482aeae0ebd4fc37b1efd7',1,'operator/(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeffd81f4b90d5e1fb4f7d8658d595a73',1,'operator/(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae885e6e18ed764df65cc712846fbcf82',1,'operator/(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e271106bb16c64506b78f50599ffad0',1,'operator/(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2af76884f887a6bae64783d7cfa3fd5',1,'operator/(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga216608449d27058bfa3427d67089019b',1,'operator/(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85aa004a5cb3b6108b0041ad11574367',1,'operator/(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a42711792e9b1ed79c25959954adc',1,'operator/(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04cb7fa059a6bfa8de34114ccb829475',1,'operator/(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5c764c78ba7fc0170c586345d67cf82',1,'operator/(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac28d28065b478079ccf4706cb328ad52',1,'operator/(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8722a51ca67c9eac25f2896535e5543d',1,'operator/(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd7e6744dedace2790dda951604c16f4',1,'operator/(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac20d96aa5d9bc6828f580d98be9b274b',1,'operator/(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e16dd1de3cc6cdaa3e01b991cf1877',1,'operator/(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d2ad56cb9b7935755ab98989621744',1,'operator/(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d36cf520a15e02c4639cf09d13638af',1,'operator/(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae910a0177b6e5954def12c3e1ceb7889',1,'operator/(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4b24fae841ff37f46b2f184e4214f49',1,'operator/(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9fb15ffc426038614898e8cf6f5245',1,'operator/(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad380b25d2ba11d6de6db82c39052900e',1,'operator/(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b3207d6bf2685058ea4e895ac25c678',1,'operator/(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15293a946d5146fd48c04f46b2b81845',1,'operator/(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca80d86a8a80d0a596b3c5abdc0f5b7',1,'operator/(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed6a240c984f95a345129f96274a9cfe',1,'operator/(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9f5801f25493f31c7f636c3df933b99',1,'operator/(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae74b42fba92a1278d5d20a37ff25668c',1,'operator/(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21b3dbd89341fa3f444ea21ef6e0b2f5',1,'operator/(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87509bef25c897cac8532e466e4d66a7',1,'operator/(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6653c9349dcc4767667164b9c45ecc4f',1,'operator/(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfbe8b6a853d911c6caa057249a2f3c2',1,'operator/(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac53ae2c9994299b79543fd5d25284a85',1,'operator/(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a5e479a1745b53490f2c08b0993c0e5',1,'operator/(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f5210161d628f2d4e696f26fac33d7',1,'operator/(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf75713de0f2b797667bb783913812cf5',1,'operator/(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b57e7742e16dc732c96c86c7a25a7d',1,'operator/(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53df6d0915ba0492a653459ccb61dd1e',1,'operator/(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca76e1c82d8c8fa487273dd5488b5afc',1,'operator/(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff3491be4e1aeb2d4b2ecfafac25bfc',1,'operator/(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae20c5ffaf5dc093b018dbb2c623a4a9d',1,'operator/(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga294bb78feefcf2213a99e3765bfcd590',1,'operator/(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f4874876e654be2d30711f55ba67bb9',1,'operator/(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931b2f3f4067c776bc79fa993f307479',1,'operator/(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b00fe8b4c36cb662c4528caced6e021',1,'operator/(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dd0224214d0591a4644c9fa753c613',1,'operator/(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d8b0d5eb5f540043139d7077cd89acd',1,'operator/(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa14eb5e414191a5110c9657940f4911f',1,'operator/(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845184957965ee09b2c75d19b3c943b8',1,'operator/(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98436d248883059f3789b0d0ee05623',1,'operator/(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae36ded72b3f6a63e66bf8e6bedcd1246',1,'operator/(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f5082bc85c86de08b2e0f479411caec',1,'operator/(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d17e190d57f7cbaa40be123e2a51224',1,'operator/(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41a157235e0cf757bb61bdf97c135a56',1,'operator/(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5738156055f71a2394da2fd9986e73',1,'operator/(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cbd3ba36dcb1399c0cebe931b575705',1,'operator/(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71437398c247ffa7ef5ced05aa8c32fd',1,'operator/(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca86550e3139b130209e6a73f8e288c',1,'operator/(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a9725a2048b27de8e5b4b7a962b7a45',1,'operator/(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga263e8628015d84cc51979ad5d9fab4dd',1,'operator/(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3618b8f1c4483be2b49784692b55da93',1,'operator/(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56abdc374d21db3f6d3a4750a60b46d4',1,'operator/(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga964f4c517e631519f06210ca6e00a505',1,'operator/(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7785eabab48b5412e4bec4c5ff9a221d',1,'operator/(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga985d99669358177e1081cd19cea4fb7a',1,'operator/(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ae6065edefcba07b4aab58590e4414',1,'operator/(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8820b8c1e646e150d78c6c23192d99bc',1,'operator/(const double2 &a, double s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga799ec0a9990b63bb54278d14b70b2d83',1,'std::operator/(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gace8f383fa21a65396e93711d963de127',1,'std::operator/(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9e32bc55ff4c92d724b1398241026af5',1,'std::operator/(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga799ec0a9990b63bb54278d14b70b2d83',1,'operator/(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gace8f383fa21a65396e93711d963de127',1,'operator/(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9e32bc55ff4c92d724b1398241026af5',1,'operator/(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)']]], - ['operator_2f_3d_335',['operator/=',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga0ee49b20d55c5902617e381807acb5bf',1,'cv::softdouble::operator/=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga93ae91dcfb3a27c7663a73aca75fd206',1,'cv::softfloat::operator/=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae2defbd37472f207493ea6b8a441899a',1,'std::complex::operator/=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga97944829154f734dd4b9df00a2e2820d',1,'std::complex::operator/=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4a86ee20d770ceb9779e865968faa6a7',1,'std::gslice_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2ea239d6f6f027caa976efe4821944d0',1,'std::indirect_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac1417dfc58271e6730675e151cd3dd06',1,'std::mask_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaea8c21a277b5dfee1f7f4b09c556259d',1,'std::slice_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15f95c715e3a16e30ff24477ccf4e502',1,'std::valarray::operator/=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4572c21b07ac304ac9d7062d2f5ae160',1,'std::valarray::operator/=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15f95c715e3a16e30ff24477ccf4e502',1,'valarray< size_t >::operator/=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4572c21b07ac304ac9d7062d2f5ae160',1,'valarray< size_t >::operator/=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a1717e11dfe9341e9cfba13140cedddce',1,'Eigen::ArrayBase::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a1717e11dfe9341e9cfba13140cedddce',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#af1b9165f5ab6b57a8305c0dc359adf7c',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'Eigen::VectorwiseOp::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Derived, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Derived, Vertical >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator/=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a7395bd0af29ac23fd3f21543c935cdfa.html#a7395bd0af29ac23fd3f21543c935cdfa',1,'nlohmann::json_pointer::operator/=(const json_pointer &ptr)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a7de51480324eb1c5a89ed552cd699875.html#a7de51480324eb1c5a89ed552cd699875',1,'nlohmann::json_pointer::operator/=(std::size_t array_idx)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_abdd21567b2b1d69329af0f520335e68b.html#abdd21567b2b1d69329af0f520335e68b',1,'nlohmann::json_pointer::operator/=(std::string token)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga310bc17ff9e6db416c9c633bb61ee868',1,'cv::operator/=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga93ae91dcfb3a27c7663a73aca75fd206',1,'operator/=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga0ee49b20d55c5902617e381807acb5bf',1,'operator/=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga310bc17ff9e6db416c9c633bb61ee868',1,'operator/=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae2defbd37472f207493ea6b8a441899a',1,'operator/=(const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga97944829154f734dd4b9df00a2e2820d',1,'operator/=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4a86ee20d770ceb9779e865968faa6a7',1,'operator/=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15f95c715e3a16e30ff24477ccf4e502',1,'operator/=(const _Tp &)(Global Namespace)']]], - ['operator_3c_336',['operator<',['https://docs.opencv.org/4.2.0/df/da3/structcv_1_1linemod_1_1QuantizedPyramid_1_1Candidate.html#aa07e4d047df342b0f27b19d1827714f5',1,'cv::linemod::QuantizedPyramid::Candidate::operator<()'],['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#a61ebd9532acb52577d28c0dfefbcb660',1,'cv::DMatch::operator<()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ada726685b67ed5fa4432cc30fb854d34',1,'cv::FileNodeIterator::operator<(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ada726685b67ed5fa4432cc30fb854d34',1,'cv::FileNodeIterator::operator<(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html#ae9655069c8161475dd6c1ff504a6c89f',1,'cv::detail::GraphEdge::operator<()'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a1a987ff8d8b29707c7562206e678a4e8',1,'cv::linemod::Match::operator<()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga479ccee369fff799ced2c404cec35be7',1,'cv::stereo::Match::operator<()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8dbe9fe15d257dbb1a566dd5b752b718',1,'cv::MatExpr::operator<(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a200c6a55801095458ffba28d0bc2051f',1,'cv::MatExpr::operator<(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a027193236c695aef28e54acf23cad5ca',1,'cv::MatExpr::operator<(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac8bc126f547c720e5ec31ce26b31f6bd',1,'cv::MatExpr::operator<(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac30c6355f02755419479b1ffaadd5728',1,'cv::MatExpr::operator<(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8dbe9fe15d257dbb1a566dd5b752b718',1,'cv::MatExpr::operator<(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a200c6a55801095458ffba28d0bc2051f',1,'cv::MatExpr::operator<(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a027193236c695aef28e54acf23cad5ca',1,'cv::MatExpr::operator<(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac8bc126f547c720e5ec31ce26b31f6bd',1,'cv::MatExpr::operator<(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac30c6355f02755419479b1ffaadd5728',1,'cv::MatExpr::operator<(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4124a96f9c9f5f9ebdee548914bf7a04',1,'cv::softdouble::operator<()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga86f3dce677d4a2fb357774c872647522',1,'cv::softfloat::operator<()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#a2bf5c5fcb9aba7fef572a48701d84f9d',1,'__gnu_parallel::_GuardedIterator::operator<'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aacd442b66140c764c594ac8ad7dfd5b3.html#aacd442b66140c764c594ac8ad7dfd5b3',1,'nlohmann::basic_json::operator<'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a52907b78829a55473f2548530cf2c1c7.html#a52907b78829a55473f2548530cf2c1c7',1,'nlohmann::basic_json::operator<'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a71f65ff3abee4c140e27ca64fa327973.html#a71f65ff3abee4c140e27ca64fa327973',1,'nlohmann::basic_json::operator<'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga0e974552b8acc15ea6043ec9cb3a2f44',1,'cv::operator<()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga009cbdc2c91163c286b62fd0bda874c4',1,'cv::cudev::operator<(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga720988e66770098270dbf4cba3d0a570',1,'cv::cudev::operator<(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2de2ba6d33f0f4fcdce970163f47fdb',1,'cv::cudev::operator<(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1001ed9d71e36d2d05c7c0226e4b811e',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4360f50f4aa43506746b04131967e37f',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9233091fdc2614e17dc56697f473ffd',1,'cv::cudev::operator<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0fef7f08d2f37ea7d3e7e59dd68eb1',1,'cv::cudev::operator<(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16563b7c88d735d3b93688d49ecca618',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3351ed0be9b2d6c0f30e9fc13ff0c8f2',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3232fcf3bcad7b1bb9e25bc4dc8e8860',1,'cv::cudev::operator<(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8035e6b052b86212b9290f045b49880',1,'cv::cudev::operator<(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0c410fca36f863f7630eb9688527',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa6f80ff4bc920f6653de63d42ed7e4',1,'cv::cudev::operator<(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac87884be3df070c671185a3c337298f5',1,'cv::cudev::operator<(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14bd8d044c4a278d4ba11588f5de7e2',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d75de24d1d9fbceb70565ca0341945',1,'cv::cudev::operator<(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa80300a972f7a420a010418c5deba9ca',1,'cv::cudev::operator<(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2d5efdf0de121487a6c531f99a6aaef',1,'cv::cudev::operator<(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79ac15ae7290ba39734d1aa37b1f072d',1,'cv::cudev::operator<(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2876596449fc6df9b470e3fe7252b0b',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4622e8f2d5fe5c36196f75bf8007b65',1,'cv::cudev::operator<(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9caf802fa8a65f71f42c8dffa60b318e',1,'cv::cudev::operator<(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dcde070edfa0b5575ce1b3ef503a779',1,'cv::cudev::operator<(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4162b25914b86079cf6b5c53a0bf92',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1e0f762ec13a9e0696855d2e83c692',1,'cv::cudev::operator<(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbe24952f097c0d9c6c9a669c9cbc130',1,'cv::cudev::operator<(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d26c2d02ce10ebfb67caca78e3263c2',1,'cv::cudev::operator<(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9f48d27e0dee369fa39239649ff948a',1,'cv::cudev::operator<(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eaf9aa54d8f3da1be1ab7593bc2918d',1,'cv::cudev::operator<(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1984dfdc91c77e0b2c7e3b0a549964d0',1,'cv::cudev::operator<(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee672427c981240174bb011adf7eb2e8',1,'cv::cudev::operator<(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3197e6bd63fe3b34fa21cf628ab4b2',1,'cv::cudev::operator<(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa031b73d86c8be33e09376abc5865c0b',1,'cv::cudev::operator<(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8f7518c0f408bc6b3940a887bd66d98',1,'cv::cudev::operator<(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034332a898ca12ab5055dcf56d144bab',1,'cv::cudev::operator<(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29838c4abfedff62af6e26f3d62f1da3',1,'cv::cudev::operator<(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9955935230b18c47941eb13d110520',1,'cv::cudev::operator<(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf000ab97193855a862d9374ca0413322',1,'cv::cudev::operator<(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82e21f74ab115cb8d8b130ea0aa38de1',1,'cv::cudev::operator<(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29dfd373e87547b2189a785bdd2d2d30',1,'cv::cudev::operator<(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e3ceeaa992b5389d70a970e723ebcb6',1,'cv::cudev::operator<(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47537c956d1de80e0957697c5cfc5807',1,'cv::cudev::operator<(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1be1cc49d4cecd7a5429de37a81150',1,'cv::cudev::operator<(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27ccf7cfaefc9b9bb196d6134d514954',1,'cv::cudev::operator<(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a7cbda5c7b76068d44b423ba3180197',1,'cv::cudev::operator<(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8c2178181fbb679c4b0a9917b037d6',1,'cv::cudev::operator<(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5302aa2958867fbe5d6103d02587c42',1,'cv::cudev::operator<(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5c4b2c41ed0b03aa208217b10ecd153',1,'cv::cudev::operator<(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga273e57446ed81c0483ba887dd3f93acd',1,'cv::cudev::operator<(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga954fbd581d81f4a0f22937b67cf4bd1a',1,'cv::cudev::operator<(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f78c5aa99e7921f2acb3369662ea8',1,'cv::cudev::operator<(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99b41f158893fb62ff2ec68aa59e1fe8',1,'cv::cudev::operator<(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ba0f960fc417bb64c06b91985160306',1,'cv::cudev::operator<(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0fea95e1138b1be0462bfd06d39e21',1,'cv::cudev::operator<(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac69d2269b390083983094fc05522d3e4',1,'cv::cudev::operator<(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga502b1092946623165164f1eb3db5ec13',1,'cv::cudev::operator<(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacbd2df713f63e213f3c935942f8b789d',1,'cv::cudev::operator<(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cd8a0ab74fe1776ba27691cb9dc0bb1',1,'cv::cudev::operator<(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0dfcd65770b6f6f97c624b03b456219',1,'cv::cudev::operator<(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1c5fb881e5d825b65978c18468c2aa',1,'cv::cudev::operator<(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a482c5969940a7c6039aaaa365f1bc2',1,'cv::cudev::operator<(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc2b224af30927d91ccc96465940505',1,'cv::cudev::operator<(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e887a468977d874479b527d09649134',1,'cv::cudev::operator<(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9ee2e0ba4e219c9fd9f181a7a7e7829',1,'cv::cudev::operator<(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace7961c4f78672879296988127017dc7',1,'cv::cudev::operator<(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb96b9fa9eb4cfd5063728a52752c92',1,'cv::cudev::operator<(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20019500f5925231a8e453e066061b56',1,'cv::cudev::operator<(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef934652424e05dd36af802f8f463631',1,'cv::cudev::operator<(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fd192ad18d856a0df0189ac2df19e42',1,'cv::cudev::operator<(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395ea80af7d2745dab132bbdaa9d3894',1,'cv::cudev::operator<(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76bda195f33e2574a6c60450460c5e14',1,'cv::cudev::operator<(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07693623464c75318cf0dc62902993c9',1,'cv::cudev::operator<(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b93fe9997af973d95ce09182e6f83cd',1,'cv::cudev::operator<(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56a8ddd35f97a00f47f1c58174be300d',1,'cv::cudev::operator<(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd969c3c0fae8b79b41eb91e215a0f6c',1,'cv::cudev::operator<(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae23831834eef58d15594a6de775cb097',1,'cv::cudev::operator<(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae335ff1785c5c99e207d81955d320243',1,'cv::cudev::operator<(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587f8bd580b1cbf02d82319eee32cac9',1,'cv::cudev::operator<(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e02a23a9900338a83321e93d6cb849',1,'cv::cudev::operator<(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga123f05595c78e1eb9c5ae4af2df3fedf',1,'cv::cudev::operator<(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b933d7e73b54df55090a05d233e76ed',1,'cv::cudev::operator<(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab81a6520e9c56086d5938319b47f5ee4',1,'cv::cudev::operator<(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52733db0ac977cc46e56471cb549a6f4',1,'cv::cudev::operator<(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24c3d47e3e73e50e6a7c94175a0779a2',1,'cv::cudev::operator<(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga972d5282ac2202923f870ea8bb918140',1,'cv::cudev::operator<(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e4eca8de66ce6c3006c8c83dca5b83e',1,'cv::cudev::operator<(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd9e7ebda1d8aad9ca5b6dca517b019e',1,'cv::cudev::operator<(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf952eaa3fb132711c2f6ba89ebdd98b7',1,'cv::cudev::operator<(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga098db186cca858509dc51d532b5d7564',1,'cv::cudev::operator<(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a1be5b2b49f5e029ec733450ce10fbd',1,'cv::cudev::operator<(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga579e4cccc35c306c9bed75e01586aa9d',1,'cv::cudev::operator<(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfff9bd4dde1a4bb8e90b7c15e3a3bc1',1,'cv::cudev::operator<(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdd8113fc7213a912edfcb42071db45',1,'cv::cudev::operator<(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b13aeb71dbcf00af868786d733cb6b8',1,'cv::cudev::operator<(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga364d06fad2cedd8ea6ead77708f6872a',1,'cv::cudev::operator<(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf19430d38270527b027e367dd8f75374',1,'cv::cudev::operator<(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48f6f225dc0f298b4550e3bee2922237',1,'cv::cudev::operator<(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e9cb1782ba4f252f4bf7faa67e37a9f',1,'cv::cudev::operator<(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94129d6207f24868de8cb10ea14e103',1,'cv::cudev::operator<(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bcaa50d0526305b450eb7388e30e79',1,'cv::cudev::operator<(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41ad1e69567d7b71a7e5d251f5105b9',1,'cv::cudev::operator<(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47873f124d86cc20cc38b12aad2822a7',1,'cv::cudev::operator<(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a12a1d99cffc29b3a5d722a3bc24eb',1,'cv::cudev::operator<(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa774569fab758f87ea2f32da59541701',1,'cv::cudev::operator<(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e852a418f5730b03e7b2cee91cf78f5',1,'cv::cudev::operator<(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bc4c0b02d2261a0a8f073ea42012509',1,'cv::cudev::operator<(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac42d55945bb2f549eac6b422d70134e9',1,'cv::cudev::operator<(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b8bf0a9ddf12f5978fa840bbb1281c1',1,'cv::cudev::operator<(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe6f82b9b2d38747c4d07bdd384d344',1,'cv::cudev::operator<(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05d714d19bf702199d8bd7e008d8549c',1,'cv::cudev::operator<(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54d0a4a5dc2a8b97726c52d724cd7de4',1,'cv::cudev::operator<(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9d3a1bb44b76d738543a582e2178ebb',1,'cv::cudev::operator<(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3355798174802823946fd7d843d11e6e',1,'cv::cudev::operator<(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572769430e10effec5056d6df7efa16c',1,'cv::cudev::operator<(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ad33b110711b4827718cfef458d5ed7',1,'cv::cudev::operator<(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac72dfaedbb3a827ed78228af321574a1',1,'cv::cudev::operator<(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75730e1d5cede97eb4faf4f1bd833227',1,'cv::cudev::operator<(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e43019fba0109832ea5b5f74e1e92ff',1,'cv::cudev::operator<(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac46443ae5909e3a5066c06f208610caf',1,'cv::cudev::operator<(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae85889915d683c12e077cb4ec5083c2e',1,'cv::cudev::operator<(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga86f3dce677d4a2fb357774c872647522',1,'operator<(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4124a96f9c9f5f9ebdee548914bf7a04',1,'operator<(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga0e974552b8acc15ea6043ec9cb3a2f44',1,'operator<(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga009cbdc2c91163c286b62fd0bda874c4',1,'operator<(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga720988e66770098270dbf4cba3d0a570',1,'operator<(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2de2ba6d33f0f4fcdce970163f47fdb',1,'operator<(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1001ed9d71e36d2d05c7c0226e4b811e',1,'operator<(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4360f50f4aa43506746b04131967e37f',1,'operator<(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9233091fdc2614e17dc56697f473ffd',1,'operator<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0fef7f08d2f37ea7d3e7e59dd68eb1',1,'operator<(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16563b7c88d735d3b93688d49ecca618',1,'operator<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3351ed0be9b2d6c0f30e9fc13ff0c8f2',1,'operator<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3232fcf3bcad7b1bb9e25bc4dc8e8860',1,'operator<(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8035e6b052b86212b9290f045b49880',1,'operator<(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0c410fca36f863f7630eb9688527',1,'operator<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa6f80ff4bc920f6653de63d42ed7e4',1,'operator<(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac87884be3df070c671185a3c337298f5',1,'operator<(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14bd8d044c4a278d4ba11588f5de7e2',1,'operator<(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d75de24d1d9fbceb70565ca0341945',1,'operator<(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa80300a972f7a420a010418c5deba9ca',1,'operator<(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2d5efdf0de121487a6c531f99a6aaef',1,'operator<(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79ac15ae7290ba39734d1aa37b1f072d',1,'operator<(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2876596449fc6df9b470e3fe7252b0b',1,'operator<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4622e8f2d5fe5c36196f75bf8007b65',1,'operator<(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9caf802fa8a65f71f42c8dffa60b318e',1,'operator<(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dcde070edfa0b5575ce1b3ef503a779',1,'operator<(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4162b25914b86079cf6b5c53a0bf92',1,'operator<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1e0f762ec13a9e0696855d2e83c692',1,'operator<(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbe24952f097c0d9c6c9a669c9cbc130',1,'operator<(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d26c2d02ce10ebfb67caca78e3263c2',1,'operator<(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9f48d27e0dee369fa39239649ff948a',1,'operator<(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eaf9aa54d8f3da1be1ab7593bc2918d',1,'operator<(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1984dfdc91c77e0b2c7e3b0a549964d0',1,'operator<(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee672427c981240174bb011adf7eb2e8',1,'operator<(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3197e6bd63fe3b34fa21cf628ab4b2',1,'operator<(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa031b73d86c8be33e09376abc5865c0b',1,'operator<(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8f7518c0f408bc6b3940a887bd66d98',1,'operator<(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034332a898ca12ab5055dcf56d144bab',1,'operator<(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29838c4abfedff62af6e26f3d62f1da3',1,'operator<(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9955935230b18c47941eb13d110520',1,'operator<(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf000ab97193855a862d9374ca0413322',1,'operator<(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82e21f74ab115cb8d8b130ea0aa38de1',1,'operator<(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29dfd373e87547b2189a785bdd2d2d30',1,'operator<(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e3ceeaa992b5389d70a970e723ebcb6',1,'operator<(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47537c956d1de80e0957697c5cfc5807',1,'operator<(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1be1cc49d4cecd7a5429de37a81150',1,'operator<(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27ccf7cfaefc9b9bb196d6134d514954',1,'operator<(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a7cbda5c7b76068d44b423ba3180197',1,'operator<(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8c2178181fbb679c4b0a9917b037d6',1,'operator<(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5302aa2958867fbe5d6103d02587c42',1,'operator<(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5c4b2c41ed0b03aa208217b10ecd153',1,'operator<(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga273e57446ed81c0483ba887dd3f93acd',1,'operator<(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga954fbd581d81f4a0f22937b67cf4bd1a',1,'operator<(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f78c5aa99e7921f2acb3369662ea8',1,'operator<(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99b41f158893fb62ff2ec68aa59e1fe8',1,'operator<(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ba0f960fc417bb64c06b91985160306',1,'operator<(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0fea95e1138b1be0462bfd06d39e21',1,'operator<(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac69d2269b390083983094fc05522d3e4',1,'operator<(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga502b1092946623165164f1eb3db5ec13',1,'operator<(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacbd2df713f63e213f3c935942f8b789d',1,'operator<(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cd8a0ab74fe1776ba27691cb9dc0bb1',1,'operator<(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0dfcd65770b6f6f97c624b03b456219',1,'operator<(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1c5fb881e5d825b65978c18468c2aa',1,'operator<(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a482c5969940a7c6039aaaa365f1bc2',1,'operator<(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc2b224af30927d91ccc96465940505',1,'operator<(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e887a468977d874479b527d09649134',1,'operator<(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9ee2e0ba4e219c9fd9f181a7a7e7829',1,'operator<(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace7961c4f78672879296988127017dc7',1,'operator<(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb96b9fa9eb4cfd5063728a52752c92',1,'operator<(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20019500f5925231a8e453e066061b56',1,'operator<(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef934652424e05dd36af802f8f463631',1,'operator<(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fd192ad18d856a0df0189ac2df19e42',1,'operator<(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395ea80af7d2745dab132bbdaa9d3894',1,'operator<(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76bda195f33e2574a6c60450460c5e14',1,'operator<(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07693623464c75318cf0dc62902993c9',1,'operator<(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b93fe9997af973d95ce09182e6f83cd',1,'operator<(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56a8ddd35f97a00f47f1c58174be300d',1,'operator<(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd969c3c0fae8b79b41eb91e215a0f6c',1,'operator<(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae23831834eef58d15594a6de775cb097',1,'operator<(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae335ff1785c5c99e207d81955d320243',1,'operator<(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587f8bd580b1cbf02d82319eee32cac9',1,'operator<(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e02a23a9900338a83321e93d6cb849',1,'operator<(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga123f05595c78e1eb9c5ae4af2df3fedf',1,'operator<(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b933d7e73b54df55090a05d233e76ed',1,'operator<(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab81a6520e9c56086d5938319b47f5ee4',1,'operator<(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52733db0ac977cc46e56471cb549a6f4',1,'operator<(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24c3d47e3e73e50e6a7c94175a0779a2',1,'operator<(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga972d5282ac2202923f870ea8bb918140',1,'operator<(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e4eca8de66ce6c3006c8c83dca5b83e',1,'operator<(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd9e7ebda1d8aad9ca5b6dca517b019e',1,'operator<(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf952eaa3fb132711c2f6ba89ebdd98b7',1,'operator<(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga098db186cca858509dc51d532b5d7564',1,'operator<(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a1be5b2b49f5e029ec733450ce10fbd',1,'operator<(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga579e4cccc35c306c9bed75e01586aa9d',1,'operator<(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfff9bd4dde1a4bb8e90b7c15e3a3bc1',1,'operator<(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdd8113fc7213a912edfcb42071db45',1,'operator<(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b13aeb71dbcf00af868786d733cb6b8',1,'operator<(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga364d06fad2cedd8ea6ead77708f6872a',1,'operator<(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf19430d38270527b027e367dd8f75374',1,'operator<(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48f6f225dc0f298b4550e3bee2922237',1,'operator<(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e9cb1782ba4f252f4bf7faa67e37a9f',1,'operator<(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94129d6207f24868de8cb10ea14e103',1,'operator<(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bcaa50d0526305b450eb7388e30e79',1,'operator<(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41ad1e69567d7b71a7e5d251f5105b9',1,'operator<(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47873f124d86cc20cc38b12aad2822a7',1,'operator<(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a12a1d99cffc29b3a5d722a3bc24eb',1,'operator<(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa774569fab758f87ea2f32da59541701',1,'operator<(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e852a418f5730b03e7b2cee91cf78f5',1,'operator<(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bc4c0b02d2261a0a8f073ea42012509',1,'operator<(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac42d55945bb2f549eac6b422d70134e9',1,'operator<(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b8bf0a9ddf12f5978fa840bbb1281c1',1,'operator<(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe6f82b9b2d38747c4d07bdd384d344',1,'operator<(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05d714d19bf702199d8bd7e008d8549c',1,'operator<(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54d0a4a5dc2a8b97726c52d724cd7de4',1,'operator<(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9d3a1bb44b76d738543a582e2178ebb',1,'operator<(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3355798174802823946fd7d843d11e6e',1,'operator<(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572769430e10effec5056d6df7efa16c',1,'operator<(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ad33b110711b4827718cfef458d5ed7',1,'operator<(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac72dfaedbb3a827ed78228af321574a1',1,'operator<(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75730e1d5cede97eb4faf4f1bd833227',1,'operator<(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e43019fba0109832ea5b5f74e1e92ff',1,'operator<(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac46443ae5909e3a5066c06f208610caf',1,'operator<(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae85889915d683c12e077cb4ec5083c2e',1,'operator<(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga479ccee369fff799ced2c404cec35be7',1,'operator<(const Match &rhs) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a322f7449964a51cfe95142e14db0ef72',1,'__gnu_cxx::operator<(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ad7d9e389800dcea7b1748d08f70f0358',1,'__gnu_cxx::operator<(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#afdc865f8e1dd5fb8be54c6a608d6ca17',1,'__gnu_cxx::operator<(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53d215eee36632ee43c5039c54d648ae',1,'std::operator<(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7d32b48a9dc0ee1316aedbde00a1a8fd',1,'std::operator<(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga69e152dbea8e3ca77b307634084fb164',1,'std::operator<(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a203ef17a8b706e78acfa3d05f30e20ca',1,'std::operator<(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7f56f6da4d4f20444cbbab54a95e99e5',1,'std::operator<(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gad9079e03d834c2dfd61dfae4f73f0031',1,'std::operator<(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga341b35e5b4af405e08d5c2abb676cf39',1,'std::operator<(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a64f0c6157f108a5bfe4ac5096e5bc4b2',1,'std::operator<(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20182f0fe24d991ad8a8daede16933fa',1,'std::operator<(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga11e1ee39f1b05e646abe2caea0565967',1,'std::operator<(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga01622c3d750044cf92cd8a1eaa89ca5b',1,'std::operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1862d7e70ac15663db23831edbc4d06f',1,'std::operator<(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5e86344cdca451bac42e9d9936e99353',1,'std::operator<(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a3cbf6143f4ce61b7174408e06a4181f0',1,'std::operator<(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gabc00ef86c05a9226d2007dd587c196f3',1,'std::operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8fcefae1f44d9e5656f2231d04742454',1,'std::operator<(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7b31ae4487ff01fcb215071c0f521caa',1,'std::operator<(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a15c710c3bf507d1a7bdf5f8de40cafe2',1,'std::operator<(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa0eb871a6a5db29c6fa9c682b7808bdd',1,'std::operator<(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a27a4470c800ce13f6c1220c5ec11c360',1,'std::operator<(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5a6f7a1317ae28e6f2b71a0497873e25',1,'std::operator<(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gad9079e03d834c2dfd61dfae4f73f0031',1,'operator<(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga341b35e5b4af405e08d5c2abb676cf39',1,'operator<(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20182f0fe24d991ad8a8daede16933fa',1,'operator<(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga11e1ee39f1b05e646abe2caea0565967',1,'operator<(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga01622c3d750044cf92cd8a1eaa89ca5b',1,'operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1862d7e70ac15663db23831edbc4d06f',1,'operator<(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gabc00ef86c05a9226d2007dd587c196f3',1,'operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga69e152dbea8e3ca77b307634084fb164',1,'operator<(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], - ['operator_3c_3c_337',['operator<<',['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html#acb48faff22c3db55ffa8ea8d1b438983',1,'cv::dnn::Dict::operator<<'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a3e2e82153741f26c1fa03c1b98961006',1,'cv::dnn::DictValue::operator<<'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a5d64e1a22e8e659de99a027f66bf26bc',1,'cv::FileStorage::operator<<(FileStorage &fs, const String &str)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a84431fd1b5075275f5c3407dc58b36ae',1,'cv::FileStorage::operator<<(FileStorage &fs, const _Tp &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#acdfed1145ad6cc92e20975596c7b8bed',1,'cv::FileStorage::operator<<(FileStorage &fs, const char *str)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae1a501b3d13d8fd3de1b7299926a02cd',1,'cv::FileStorage::operator<<(FileStorage &fs, char *value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a84431fd1b5075275f5c3407dc58b36ae',1,'cv::FileStorage::operator<<(FileStorage &fs, const _Tp &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#acdfed1145ad6cc92e20975596c7b8bed',1,'cv::FileStorage::operator<<(FileStorage &fs, const char *str)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae1a501b3d13d8fd3de1b7299926a02cd',1,'cv::FileStorage::operator<<(FileStorage &fs, char *value)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a674a3009537b05a655ad483acd8e09eb',1,'cv::VideoWriter::operator<<(const Mat &image)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#ad9a866bd422a46216993e8015f8f68cf',1,'cv::VideoWriter::operator<<(const UMat &image)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'basic_iostream< char >::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'basic_iostream< char >::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_iostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_iostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_iostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_iostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_iostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_iostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_iostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_iostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_iostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_iostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_iostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_iostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_iostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_iostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_iostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_iostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_iostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_iostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_iostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_iostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_iostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_iostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_iostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_iostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_iostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_iostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_iostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_iostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_iostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_iostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'basic_ostream< char >::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'basic_ostream< char >::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'basic_ostream< char, _Traits >::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'basic_ostream< char, _Traits >::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char, _Traits >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char, _Traits >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char, _Traits >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char, _Traits >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char, _Traits >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char, _Traits >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char, _Traits >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char, _Traits >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char, _Traits >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char, _Traits >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char, _Traits >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char, _Traits >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char, _Traits >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char, _Traits >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char, _Traits >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char, _Traits >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char, _Traits >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char, _Traits >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char, _Traits >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char, _Traits >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char, _Traits >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char, _Traits >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char, _Traits >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char, _Traits >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char, _Traits >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char, _Traits >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char, _Traits >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char, _Traits >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char, _Traits >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char, _Traits >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a706fe0713381598aee2cf988bc299e5e',1,'gamma_distribution< double >::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a706fe0713381598aee2cf988bc299e5e',1,'gamma_distribution< result_type >::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#acc44ab3c56e9048acd13c60ca1a877e0',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abdfecf8325ed9e856625871fee2c56a3',1,'normal_distribution< double >::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abdfecf8325ed9e856625871fee2c56a3',1,'normal_distribution< result_type >::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_fstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_fstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_fstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_fstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_fstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_fstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_fstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_fstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_fstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_fstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_fstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_fstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_fstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_fstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_fstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_fstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_fstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_fstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_fstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_fstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_fstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_fstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_fstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_fstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_fstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_fstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_fstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_fstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_fstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_fstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_fstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_fstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_iostream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_iostream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_iostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_iostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_iostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_iostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_iostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_iostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_iostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_iostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_iostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_iostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_iostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_iostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_iostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_iostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_iostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_iostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_iostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_iostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_iostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_iostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_iostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_iostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_iostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_iostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_iostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_iostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_iostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_iostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_iostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_iostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_ofstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_ofstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ofstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ofstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ofstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ofstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ofstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ofstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ofstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ofstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ofstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ofstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ofstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ofstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ofstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ofstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ofstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ofstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ofstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ofstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ofstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ofstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ofstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ofstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ofstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ofstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ofstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ofstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ofstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ofstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ofstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ofstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_ostream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_ostream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_ostringstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_ostringstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_stringstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_stringstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_stringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_stringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_stringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_stringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_stringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_stringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_stringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_stringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_stringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_stringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_stringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_stringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_stringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_stringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_stringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_stringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_stringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_stringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_stringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_stringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_stringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_stringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_stringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_stringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_stringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_stringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_stringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_stringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_stringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_stringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a414a99f11823d3fdfed86fc37f55690b',1,'std::binomial_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a725f2ea3af449e1e3286300e694d863d',1,'std::bitset::operator<<(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a725f2ea3af449e1e3286300e694d863d',1,'std::bitset::operator<<(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#aebe1b72f5b814d959f807aaaf5e6319e',1,'std::chi_squared_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#acefef9fae1a48c92ebc15b4c930dbf08',1,'std::discard_block_engine::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a0da5726a47d5a89fc4d67118558d5834',1,'std::discrete_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#ae32074f867a5686e7e7dab19d6f4cf2b',1,'std::fisher_f_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a706fe0713381598aee2cf988bc299e5e',1,'std::gamma_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#af5e6423d264a9888844b74c2f9944199',1,'std::linear_congruential_engine::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#aad98f5fc7ecc4ae82fe15f6a67e80d1f',1,'std::lognormal_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#acc44ab3c56e9048acd13c60ca1a877e0',1,'std::mersenne_twister_engine::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#a57bcf7aaeecf810d2c7c6c3f0c9f4fbe',1,'std::negative_binomial_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abdfecf8325ed9e856625871fee2c56a3',1,'std::normal_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a21261460e85c8e44b5e16af905d5340e',1,'std::piecewise_constant_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#aafa2a9199eaba83988659ff880994af5',1,'std::piecewise_linear_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a9264a0eb6efd5ac01a57ed452e6f6d9a',1,'std::poisson_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a3f5b86dc97ab5a895d0860b6414f9350',1,'std::shuffle_order_engine::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a933f8fad751874c75b687b3c6db144b4',1,'std::student_t_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a877333097a3e4f3b054c3c763654e965',1,'std::subtract_with_carry_engine::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a436906ba9f65924c521aba3f4c981616',1,'std::tr2::dynamic_bitset::operator<<(size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a436906ba9f65924c521aba3f4c981616',1,'std::tr2::dynamic_bitset::operator<<(size_type __pos) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'Eigen::DenseBase::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'Eigen::DenseBase::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'Eigen::DenseBase::operator<<(std::ostream &s, const DenseBase< Derived > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator<<(std::ostream &s, const DenseBase< ArrayWrapper< ExpressionType > > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator<<(std::ostream &s, const DenseBase< Homogeneous< MatrixType, _Direction > > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'DenseBase< Solve< Decomposition, RhsType > >::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'DenseBase< Solve< Decomposition, RhsType > >::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'DenseBase< Solve< Decomposition, RhsType > >::operator<<(std::ostream &s, const DenseBase< Solve< Decomposition, RhsType > > &m)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5e34c5435e557d0bf666bd7311211405.html#a5e34c5435e557d0bf666bd7311211405',1,'nlohmann::basic_json::operator<<'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a60ca396028b8d9714c6e10efbf475af6.html#a60ca396028b8d9714c6e10efbf475af6',1,'nlohmann::basic_json::operator<<'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#abadf4e6fb19d70207d8e5600747b8c2c',1,'cv::operator<<(std::ostream &os, const GMetaArg &)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a83a3132a9b08145ceb61a56eb1abcd11',1,'cv::operator<<(std::ostream &os, const cv::GArrayDesc &desc)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a0c9fa53616ecd94efd7e9359dd439cb0',1,'cv::operator<<(std::ostream &os, const cv::GScalarDesc &desc)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#aa078055dbff233794a73da855cdd1288',1,'cv::operator<<(std::ostream &os, const cv::GMatDesc &desc)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5cdb7018d77509d22194d74f8e066f4c',1,'cv::operator<<(std::ostream &out, const TickMeter &tm)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacef821c50106276406bf4bc1cd7a059a',1,'cv::operator<<(const v_reg< _Tp, n > &a, int imm)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf47f069bbc73929ec5fd73ce9947339a',1,'cv::operator<<(String &out, Ptr< Formatted > fmtd)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3557054d1f0f079cf5e60a44851e4c70',1,'cv::operator<<(String &out, const Mat &mtx)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89d6a7eb3b4253c351bdd5c87bd6e15c',1,'cv::cudev::operator<<(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac309e654bf56a92bce54257f60224978',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37724ee1b2714aa21d8333bdd0b60332',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d89446b9cd1b84d4c54b3626ea797dd',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23de5acc1ec45d07a00fe8f37f7f2702',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2526c7f52b4492a5c8f41c30b2f21de',1,'cv::cudev::operator<<(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdab9d7d458a6819636e2031176dbf19',1,'cv::cudev::operator<<(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf98ccc0340ec81f52ec4c4079978a10a',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fbe62deadc03136397368ef9858f6f7',1,'cv::cudev::operator<<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf970863271a297e3197d7f9d1c6fba2c',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5141661e7abfe6f695104cd2f80199cc',1,'cv::cudev::operator<<(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa02b5451a03bbfe3fb34a0997e2c337f',1,'cv::cudev::operator<<(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca5eab3b992fbcf25f4089bd19ba2d80',1,'cv::cudev::operator<<(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e6980cc8c55e7d4d2a6b543d5ea145d',1,'cv::cudev::operator<<(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6a5b89d72294aa4f962767ee2fc0537',1,'cv::cudev::operator<<(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5184147f1ae14d34ebe791b02bb23617',1,'cv::cudev::operator<<(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac84a8246095fdb1ee004cff3802ab4e0',1,'cv::cudev::operator<<(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83575e7f013d7c113a991948c4b65314',1,'cv::cudev::operator<<(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga342190a6ce5ef956b5b54a8f9b2c7317',1,'cv::cudev::operator<<(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32b6410f888d77e0bd160d6fe83824',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e299bf0650ac5d0f894ac165109e219',1,'cv::cudev::operator<<(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b494e6b58845e60c37350325d48268',1,'cv::cudev::operator<<(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f12be0b00cb28aa3a721b8dc96c9bc',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga519fefe984648ac2ccb3778d3ed0b48b',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a848acecc1b2682cf97f8da363569e24f',1,'cv::dnn::operator<<()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a41e9a5ded43842da10ea7875e9d9a1aa',1,'cv::gapi::own::operator<<(std::ostream &o, const Rect &rect)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ad54ba083ef5d8b00875c97b457341dc9',1,'cv::gapi::own::operator<<(std::ostream &o, const Size &s)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf47f069bbc73929ec5fd73ce9947339a',1,'operator<<(String &out, Ptr< Formatted > fmtd)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3557054d1f0f079cf5e60a44851e4c70',1,'operator<<(String &out, const Mat &mtx)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5cdb7018d77509d22194d74f8e066f4c',1,'operator<<(std::ostream &out, const TickMeter &tm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacef821c50106276406bf4bc1cd7a059a',1,'operator<<(const v_reg< _Tp, n > &a, int imm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89d6a7eb3b4253c351bdd5c87bd6e15c',1,'operator<<(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac309e654bf56a92bce54257f60224978',1,'operator<<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37724ee1b2714aa21d8333bdd0b60332',1,'operator<<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d89446b9cd1b84d4c54b3626ea797dd',1,'operator<<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23de5acc1ec45d07a00fe8f37f7f2702',1,'operator<<(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2526c7f52b4492a5c8f41c30b2f21de',1,'operator<<(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdab9d7d458a6819636e2031176dbf19',1,'operator<<(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf98ccc0340ec81f52ec4c4079978a10a',1,'operator<<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fbe62deadc03136397368ef9858f6f7',1,'operator<<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf970863271a297e3197d7f9d1c6fba2c',1,'operator<<(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5141661e7abfe6f695104cd2f80199cc',1,'operator<<(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa02b5451a03bbfe3fb34a0997e2c337f',1,'operator<<(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca5eab3b992fbcf25f4089bd19ba2d80',1,'operator<<(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e6980cc8c55e7d4d2a6b543d5ea145d',1,'operator<<(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6a5b89d72294aa4f962767ee2fc0537',1,'operator<<(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5184147f1ae14d34ebe791b02bb23617',1,'operator<<(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac84a8246095fdb1ee004cff3802ab4e0',1,'operator<<(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83575e7f013d7c113a991948c4b65314',1,'operator<<(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga342190a6ce5ef956b5b54a8f9b2c7317',1,'operator<<(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32b6410f888d77e0bd160d6fe83824',1,'operator<<(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e299bf0650ac5d0f894ac165109e219',1,'operator<<(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b494e6b58845e60c37350325d48268',1,'operator<<(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f12be0b00cb28aa3a721b8dc96c9bc',1,'operator<<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga519fefe984648ac2ccb3778d3ed0b48b',1,'operator<<(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8f7159a55b4df5308fa03b531586fb2b',1,'std::operator<<(std::basic_ostream< _Ch, _Tr > &__os, const __shared_ptr< _Tp, _Lp > &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga2ba7b3cbabd5345e19d26796f766c6c0',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__os, const complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8d0f4660661dc80ee079bdfa88eebd2b',1,'std::operator<<(_Ostream &&__os, const _Tp &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga1e56f8bee410b0ebf924661d35faf834',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga3e80f96ee978fcba07dec04a3d9e1f3b',1,'std::operator<<(basic_ostream< _Ch_type, _Ch_traits > &__os, const sub_match< _Bi_iter > &__m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#ga268e36f52e1a1ba938eeaa95509796ca',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_int_distribution< _IntType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gad31a64335591da810bc4719b847783ec',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_real_distribution< _RealType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac4faea5494eaad9201d45d8687792782',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__os, const __gnu_cxx::__versa_string< _CharT, _Traits, _Alloc, _Base > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabc0fe37b26c3b5de242cd4261cde3aed',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::cauchy_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga17d284660a1656bc205dd834125e5543',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::bernoulli_distribution &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga50ccdd252598b9c017837d26588463d2',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::geometric_distribution< _IntType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga24847f7a1a655893e956f636db4e9f3a',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::exponential_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5d78bcb5583afa9e1871301f9d6d9c68',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::weibull_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga65897cd1a592c0a6c399072ec1ef7192',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::extreme_value_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7ce367a2dac030dcf212d89846f6c6ff',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__os, const basic_string< _CharT, _Traits, _Alloc > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a20aaa750b7ddf43635768c7b2d0385e6',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const bitset< _Nb > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4162d00742462ffb4e5b792edd81e594',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afe8641d2d416e2c56bae3ae4294de5f9',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abb2dcd26142d2d22961a30d8407161be',1,'std::operator<<(basic_ostream< char, _Traits > &__out, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a105a937bc8d1394e0bb683dea33b9f1b',1,'std::operator<<(basic_ostream< char, _Traits > &__out, signed char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4b69f99d144efda14d0e97f2eda925a7',1,'std::operator<<(basic_ostream< char, _Traits > &__out, unsigned char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6c05be9ccf056df69e524be5751af66b',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa6c746960bcd91f0e547628fb5f04cde',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6d6a581dcdff7c878cd963e5f14c0c56',1,'std::operator<<(basic_ostream< char, _Traits > &__out, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af3b2cf95d3db957b00a07c89c708fee2',1,'std::operator<<(basic_ostream< char, _Traits > &__out, const signed char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9d1f9961c2210c515937937c3a75b28e',1,'std::operator<<(basic_ostream< char, _Traits > &__out, const unsigned char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html#a75a3eb00bb313c120599e8341bf27d16',1,'std::__detail::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const _Quoted_string< _String, _CharT > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html#a5e78e46b4d59d40bf8839a5cb176fa6a',1,'std::__detail::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const _Quoted_string< const _CharT *, _CharT > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gaf5eb3c897d120abd3981d431b0c57b35',1,'std::tr2::operator<<()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga17d284660a1656bc205dd834125e5543',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::bernoulli_distribution &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga50ccdd252598b9c017837d26588463d2',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::geometric_distribution< _IntType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga2ba7b3cbabd5345e19d26796f766c6c0',1,'operator<<(basic_ostream< _CharT, _Traits > &__os, const complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gaf5eb3c897d120abd3981d431b0c57b35',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const dynamic_bitset< _WordT, _Alloc > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabc0fe37b26c3b5de242cd4261cde3aed',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::cauchy_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8f7159a55b4df5308fa03b531586fb2b',1,'operator<<(std::basic_ostream< _Ch, _Tr > &__os, const __shared_ptr< _Tp, _Lp > &__p)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga24847f7a1a655893e956f636db4e9f3a',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::exponential_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5d78bcb5583afa9e1871301f9d6d9c68',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::weibull_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga65897cd1a592c0a6c399072ec1ef7192',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::extreme_value_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga1e56f8bee410b0ebf924661d35faf834',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga3e80f96ee978fcba07dec04a3d9e1f3b',1,'operator<<(basic_ostream< _Ch_type, _Ch_traits > &__os, const sub_match< _Bi_iter > &__m)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#ga268e36f52e1a1ba938eeaa95509796ca',1,'operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_int_distribution< _IntType > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gad31a64335591da810bc4719b847783ec',1,'operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_real_distribution< _RealType > &)(Global Namespace)']]], - ['operator_3c_3c_3d_338',['operator<<=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac36920b534a80be4cc1e6e80c68d2be5',1,'std::bitset::operator<<=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac36920b534a80be4cc1e6e80c68d2be5',1,'std::bitset::operator<<=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga30a493dbd85a2271bcc09d9d24f387b2',1,'std::gslice_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga43fc95bcbd0f89c0468f249209eb587b',1,'std::indirect_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc9fb4be42ab111a8b17efc9480006c7',1,'std::mask_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15a72598162a7183c3be5cfdcb43a94b',1,'std::slice_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a0052dae6eec21a15abee0bb7f339611d',1,'std::tr2::dynamic_bitset::operator<<=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a0052dae6eec21a15abee0bb7f339611d',1,'std::tr2::dynamic_bitset::operator<<=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga435a2811affb685f15934a9204bed29e',1,'std::valarray::operator<<=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9635c78d05a1fcbc22885223c1432f25',1,'std::valarray::operator<<=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga435a2811affb685f15934a9204bed29e',1,'valarray< size_t >::operator<<=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9635c78d05a1fcbc22885223c1432f25',1,'valarray< size_t >::operator<<=(const valarray< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga30a493dbd85a2271bcc09d9d24f387b2',1,'operator<<=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga435a2811affb685f15934a9204bed29e',1,'operator<<=(const _Tp &)(Global Namespace)']]], - ['operator_3c_3d_339',['operator<=',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a630e58dd233abf6b6ff3393be67454c0',1,'cv::MatExpr::operator<=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abeea3d9de568017193b26eea645c98f3',1,'cv::MatExpr::operator<=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a21b436ed46cb4ec5a3628576a10190fe',1,'cv::MatExpr::operator<=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0a628b41fded09b2e899b46836590de3',1,'cv::MatExpr::operator<=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8a039003baebfa48ba24de81f7f4d931',1,'cv::MatExpr::operator<=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a630e58dd233abf6b6ff3393be67454c0',1,'cv::MatExpr::operator<=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abeea3d9de568017193b26eea645c98f3',1,'cv::MatExpr::operator<=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a21b436ed46cb4ec5a3628576a10190fe',1,'cv::MatExpr::operator<=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0a628b41fded09b2e899b46836590de3',1,'cv::MatExpr::operator<=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8a039003baebfa48ba24de81f7f4d931',1,'cv::MatExpr::operator<=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaa804bf096018d007e2a7894cdb98037a',1,'cv::softdouble::operator<=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6c17bb1577e0284585be0ba580811e8f',1,'cv::softfloat::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#a406eb3652a303e46bd225a4046401bf4',1,'__gnu_parallel::_GuardedIterator::operator<='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5c8bb5200f5eac10d31e26be46e5b1ac.html#a5c8bb5200f5eac10d31e26be46e5b1ac',1,'nlohmann::basic_json::operator<='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ae7bce6989e2bf72aa0784ca6755e22a9.html#ae7bce6989e2bf72aa0784ca6755e22a9',1,'nlohmann::basic_json::operator<='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4e96b98c1f8dfccaaa94aa0d5e77427c.html#a4e96b98c1f8dfccaaa94aa0d5e77427c',1,'nlohmann::basic_json::operator<='],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga02b1b9dcfcefdfb34dadf0cd35ba61a3',1,'cv::operator<=()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1ead1ff269aa97694b6497d29e1e29c',1,'cv::cudev::operator<=(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa62bc6367673e025ae709593a9b656e5',1,'cv::cudev::operator<=(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23f1ab559dd9692502ce026417f45408',1,'cv::cudev::operator<=(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78bf3eb6d82e42dc66cf49fb78f79231',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19f33206e415060c1a0ea1eb3000d96b',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffe8680754ff4aa69ba039a79faf6626',1,'cv::cudev::operator<=(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1da871666d7dd2e618b145e8864929e8',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga701bfc015fbda0963f2803b27aca4d33',1,'cv::cudev::operator<=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff9c454089fcf80143cd32fa50238fcd',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23bf29cabff89d8549d818ef43147c14',1,'cv::cudev::operator<=(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga296d4d026d70f8f76aab066328f3d3fa',1,'cv::cudev::operator<=(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45ca16669f94b285db4334a262f80063',1,'cv::cudev::operator<=(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22e88dd408d2e5cff64faeab249681ba',1,'cv::cudev::operator<=(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a750fb20efa2f5a06000ccf33cd759b',1,'cv::cudev::operator<=(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ce34596d222bf804c1e9bf7e3d1243',1,'cv::cudev::operator<=(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11bdd191156ebdab62005a519b325200',1,'cv::cudev::operator<=(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b2b32ec5290e7e12efc0856bd5f743',1,'cv::cudev::operator<=(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf04bc7968693077bc7d4f2823645b88e',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga008bc5070a5b0e4af5cf5191f5d6b9d6',1,'cv::cudev::operator<=(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a9a3aa7951e9c0e8d8adfbda9a72209',1,'cv::cudev::operator<=(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga818519c31a2652549a00cd4d7393d79e',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab796146ad2e11416ac65fba37c0b8625',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07ebffec69ff52e0b06760664c1f6734',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadb89b24d295438f54277d245ece9366',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fc00541a0243c34358a3bf00f4da05a',1,'cv::cudev::operator<=(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90197d0db673130bc8a100773411d4bd',1,'cv::cudev::operator<=(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7e43a07a9aa0a10c8d37116f06bd9a',1,'cv::cudev::operator<=(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc2939c217e196e51ecd1b2a3e06c153',1,'cv::cudev::operator<=(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fe4a35b631b3aaa2e0e857bcbbd6bad',1,'cv::cudev::operator<=(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae309099345eee12887e40f5b0b050f3e',1,'cv::cudev::operator<=(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad102af955636969a42dbffc6dbb01b46',1,'cv::cudev::operator<=(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc0e7fca81b7c89968d39d89dc649b7a',1,'cv::cudev::operator<=(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21fc2950b93de4f956fbaf0758feb6a1',1,'cv::cudev::operator<=(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d7b36c9336f6fc1a843e54c4df8f0e',1,'cv::cudev::operator<=(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41851377c29b820cf0506e6a0e709782',1,'cv::cudev::operator<=(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12057494f0e2df897df3fc9841779e4d',1,'cv::cudev::operator<=(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10792a96e7eb2e17bb8163ef90a323b4',1,'cv::cudev::operator<=(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7fbfe98286073cd2a5660902a39f04',1,'cv::cudev::operator<=(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a1bebcff32a1bf7d2575d05bfeb7890',1,'cv::cudev::operator<=(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff6fe97435e41e89de0bdef31594a96',1,'cv::cudev::operator<=(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa56d3d64ea9d3eb351f5df4712c7d56f',1,'cv::cudev::operator<=(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468b559ecf6624521e1c1dd45ef6d2e6',1,'cv::cudev::operator<=(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc5c1c549707034c570459ffee3e806',1,'cv::cudev::operator<=(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9643b2618b16b6ab86f270012d70212a',1,'cv::cudev::operator<=(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788e492c5f919e8367629179e2524611',1,'cv::cudev::operator<=(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb572141a492105ee211ba7c12d0777',1,'cv::cudev::operator<=(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5db9beb4e23e8a160a22aa678720a87',1,'cv::cudev::operator<=(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bed66c4065e1f21bc76995bfa99752b',1,'cv::cudev::operator<=(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e90fe2cf3b8c107bfe31aa0b2f94e3c',1,'cv::cudev::operator<=(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga576e04d2f78108d39b4461fcf6aded03',1,'cv::cudev::operator<=(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0c263dc40917991d1a7039432d3d4f9',1,'cv::cudev::operator<=(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5edc4d4087d24b678e8daf4926370ea',1,'cv::cudev::operator<=(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13f7090565e4f7e704870536ed987057',1,'cv::cudev::operator<=(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cd1eaa84e6d908ae0e907de12fdcde9',1,'cv::cudev::operator<=(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga375fc5f28c2b1e5962243287a28e5b58',1,'cv::cudev::operator<=(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab9131041d6fc4ae7360291aee9b26',1,'cv::cudev::operator<=(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f106914932b4cab06413eb2632ef2cd',1,'cv::cudev::operator<=(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04227753f6db79fdbfb9715240961a97',1,'cv::cudev::operator<=(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12191665fdc650dbf8500db71892fd0',1,'cv::cudev::operator<=(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1001c72e6391934b7daaf15c66ab0d7',1,'cv::cudev::operator<=(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75483e6deab8535ed86eb6dc65947e0f',1,'cv::cudev::operator<=(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72810c269851aae026716559fa2af537',1,'cv::cudev::operator<=(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14aafc9b0e4ab5e8090d0ac9a679583',1,'cv::cudev::operator<=(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23d29f809003619e6d82b5b7ea7de995',1,'cv::cudev::operator<=(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd09b7cc4b4786532fda053066dcbafd',1,'cv::cudev::operator<=(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31edb90c4322609ec771e66e4583739e',1,'cv::cudev::operator<=(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33819e2576485dff43ab99ca0e19560e',1,'cv::cudev::operator<=(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b66f84f7275665c91b9fed5aed59be5',1,'cv::cudev::operator<=(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35728a641902e5d67a7531342d2d43a1',1,'cv::cudev::operator<=(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e1e3238a8f002f82a398ca042d3db2',1,'cv::cudev::operator<=(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37b679d33d766b5ce00013e7c96fc4c',1,'cv::cudev::operator<=(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56fd29329dd70b608a25f8f8b462562f',1,'cv::cudev::operator<=(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92c40110cfc6a7a10651b46b15c7533e',1,'cv::cudev::operator<=(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b2a3a801109a2a06e5da8675728fe58',1,'cv::cudev::operator<=(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga250eb7cdcb64312f4e2641501dc9baee',1,'cv::cudev::operator<=(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f0089cb1db00710fd7233770bc30b60',1,'cv::cudev::operator<=(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef2bba33802f57daa91e22602079a3a7',1,'cv::cudev::operator<=(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c460da93b4a465dbb65ea6c98d08e0',1,'cv::cudev::operator<=(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247f899b55928b075fc919076f5e5949',1,'cv::cudev::operator<=(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga914be25957de16f44b85396ba88a7f5d',1,'cv::cudev::operator<=(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e5a6258674087258ec46bf94c668353',1,'cv::cudev::operator<=(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2dbc819cf82263e9ec490552404734',1,'cv::cudev::operator<=(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eff31462c5876d989bad00f346ab183',1,'cv::cudev::operator<=(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03fe55d350f74009fef23cbf85c265c4',1,'cv::cudev::operator<=(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad73033b2ed798b55ac0e978547e2dcdd',1,'cv::cudev::operator<=(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08dfbf27c72c08bc5b257948694cc3e1',1,'cv::cudev::operator<=(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7460f2ca99c07231e71c964b4b584ac',1,'cv::cudev::operator<=(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b414d7742537f5def6a1f1dbbcee688',1,'cv::cudev::operator<=(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a1f07e6149542f2488750c2af3c068',1,'cv::cudev::operator<=(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc181ce10142dbd76ee1376a3cd90fdd',1,'cv::cudev::operator<=(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40b2bb5b5a77fa89913fb57853cde453',1,'cv::cudev::operator<=(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac06f6f101ec8cfcaf490ec6f041a837f',1,'cv::cudev::operator<=(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8e0bfab992ab8a121c15af1e82829ac',1,'cv::cudev::operator<=(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e24ea99fa24b52f3669e40c16c2a0f7',1,'cv::cudev::operator<=(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1e079957fbf820718af8a90067d68a9',1,'cv::cudev::operator<=(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93b6391a06707b6be2ca59da57057086',1,'cv::cudev::operator<=(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61706e65d948e11d869534a6653c00bf',1,'cv::cudev::operator<=(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99abc45e21e9f42fd926a8e83cdab296',1,'cv::cudev::operator<=(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba541b96bbc1af333e8a13eb1dc169d',1,'cv::cudev::operator<=(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7a9638a0e70f17231a9e10fecedb0b2',1,'cv::cudev::operator<=(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga455fe5a0dbcd6e20648e5bc2dd13fd6c',1,'cv::cudev::operator<=(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2618b57557803d2ac6d3450904bf7e6',1,'cv::cudev::operator<=(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ad206b773be555181e771e60d3d80d',1,'cv::cudev::operator<=(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2589f700026397ad0058d21462da1714',1,'cv::cudev::operator<=(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac57dc63fcc9e6782a2af19c0a14bf769',1,'cv::cudev::operator<=(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5f991c778ac1f18cd26ec9a6ae5ff72',1,'cv::cudev::operator<=(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7a1cc2de07b5b85ef8a5b16d01e487b',1,'cv::cudev::operator<=(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa452eeb5d53100bd938b7e1bb338d995',1,'cv::cudev::operator<=(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987b56ea0c72d063c0556dd6cac14929',1,'cv::cudev::operator<=(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9292c118b4add3d2e427413547c585fb',1,'cv::cudev::operator<=(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546cd23c9536ca329dbc1c6cccb7497',1,'cv::cudev::operator<=(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ec0c62ac154d66d9623f15fdac7c91',1,'cv::cudev::operator<=(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f767e3bf13cbd06503128dae485024',1,'cv::cudev::operator<=(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e42dbf144296f0d9586569a04f490',1,'cv::cudev::operator<=(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga616315867d4da80fdfe8216599b6537e',1,'cv::cudev::operator<=(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92fbe24a4d7fc8e87ea5663cad49fcf1',1,'cv::cudev::operator<=(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73c4504f2ad38a1eb98bcf0da9989196',1,'cv::cudev::operator<=(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga525f070d7c6ab195d7c415794a412214',1,'cv::cudev::operator<=(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb29143e8afd81a0c0f520bb43c16b6',1,'cv::cudev::operator<=(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cb74c8f5ee39656481d92ba33911254',1,'cv::cudev::operator<=(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6c17bb1577e0284585be0ba580811e8f',1,'operator<=(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaa804bf096018d007e2a7894cdb98037a',1,'operator<=(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga02b1b9dcfcefdfb34dadf0cd35ba61a3',1,'operator<=(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1ead1ff269aa97694b6497d29e1e29c',1,'operator<=(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa62bc6367673e025ae709593a9b656e5',1,'operator<=(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23f1ab559dd9692502ce026417f45408',1,'operator<=(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78bf3eb6d82e42dc66cf49fb78f79231',1,'operator<=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19f33206e415060c1a0ea1eb3000d96b',1,'operator<=(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffe8680754ff4aa69ba039a79faf6626',1,'operator<=(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1da871666d7dd2e618b145e8864929e8',1,'operator<=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga701bfc015fbda0963f2803b27aca4d33',1,'operator<=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff9c454089fcf80143cd32fa50238fcd',1,'operator<=(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23bf29cabff89d8549d818ef43147c14',1,'operator<=(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga296d4d026d70f8f76aab066328f3d3fa',1,'operator<=(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45ca16669f94b285db4334a262f80063',1,'operator<=(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22e88dd408d2e5cff64faeab249681ba',1,'operator<=(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a750fb20efa2f5a06000ccf33cd759b',1,'operator<=(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ce34596d222bf804c1e9bf7e3d1243',1,'operator<=(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11bdd191156ebdab62005a519b325200',1,'operator<=(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b2b32ec5290e7e12efc0856bd5f743',1,'operator<=(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf04bc7968693077bc7d4f2823645b88e',1,'operator<=(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga008bc5070a5b0e4af5cf5191f5d6b9d6',1,'operator<=(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a9a3aa7951e9c0e8d8adfbda9a72209',1,'operator<=(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga818519c31a2652549a00cd4d7393d79e',1,'operator<=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab796146ad2e11416ac65fba37c0b8625',1,'operator<=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07ebffec69ff52e0b06760664c1f6734',1,'operator<=(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadb89b24d295438f54277d245ece9366',1,'operator<=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fc00541a0243c34358a3bf00f4da05a',1,'operator<=(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90197d0db673130bc8a100773411d4bd',1,'operator<=(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7e43a07a9aa0a10c8d37116f06bd9a',1,'operator<=(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc2939c217e196e51ecd1b2a3e06c153',1,'operator<=(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fe4a35b631b3aaa2e0e857bcbbd6bad',1,'operator<=(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae309099345eee12887e40f5b0b050f3e',1,'operator<=(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad102af955636969a42dbffc6dbb01b46',1,'operator<=(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc0e7fca81b7c89968d39d89dc649b7a',1,'operator<=(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21fc2950b93de4f956fbaf0758feb6a1',1,'operator<=(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d7b36c9336f6fc1a843e54c4df8f0e',1,'operator<=(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41851377c29b820cf0506e6a0e709782',1,'operator<=(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12057494f0e2df897df3fc9841779e4d',1,'operator<=(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10792a96e7eb2e17bb8163ef90a323b4',1,'operator<=(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7fbfe98286073cd2a5660902a39f04',1,'operator<=(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a1bebcff32a1bf7d2575d05bfeb7890',1,'operator<=(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff6fe97435e41e89de0bdef31594a96',1,'operator<=(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa56d3d64ea9d3eb351f5df4712c7d56f',1,'operator<=(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468b559ecf6624521e1c1dd45ef6d2e6',1,'operator<=(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc5c1c549707034c570459ffee3e806',1,'operator<=(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9643b2618b16b6ab86f270012d70212a',1,'operator<=(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788e492c5f919e8367629179e2524611',1,'operator<=(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb572141a492105ee211ba7c12d0777',1,'operator<=(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5db9beb4e23e8a160a22aa678720a87',1,'operator<=(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bed66c4065e1f21bc76995bfa99752b',1,'operator<=(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e90fe2cf3b8c107bfe31aa0b2f94e3c',1,'operator<=(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga576e04d2f78108d39b4461fcf6aded03',1,'operator<=(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0c263dc40917991d1a7039432d3d4f9',1,'operator<=(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5edc4d4087d24b678e8daf4926370ea',1,'operator<=(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13f7090565e4f7e704870536ed987057',1,'operator<=(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cd1eaa84e6d908ae0e907de12fdcde9',1,'operator<=(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga375fc5f28c2b1e5962243287a28e5b58',1,'operator<=(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab9131041d6fc4ae7360291aee9b26',1,'operator<=(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f106914932b4cab06413eb2632ef2cd',1,'operator<=(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04227753f6db79fdbfb9715240961a97',1,'operator<=(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12191665fdc650dbf8500db71892fd0',1,'operator<=(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1001c72e6391934b7daaf15c66ab0d7',1,'operator<=(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75483e6deab8535ed86eb6dc65947e0f',1,'operator<=(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72810c269851aae026716559fa2af537',1,'operator<=(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14aafc9b0e4ab5e8090d0ac9a679583',1,'operator<=(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23d29f809003619e6d82b5b7ea7de995',1,'operator<=(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd09b7cc4b4786532fda053066dcbafd',1,'operator<=(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31edb90c4322609ec771e66e4583739e',1,'operator<=(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33819e2576485dff43ab99ca0e19560e',1,'operator<=(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b66f84f7275665c91b9fed5aed59be5',1,'operator<=(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35728a641902e5d67a7531342d2d43a1',1,'operator<=(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e1e3238a8f002f82a398ca042d3db2',1,'operator<=(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37b679d33d766b5ce00013e7c96fc4c',1,'operator<=(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56fd29329dd70b608a25f8f8b462562f',1,'operator<=(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92c40110cfc6a7a10651b46b15c7533e',1,'operator<=(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b2a3a801109a2a06e5da8675728fe58',1,'operator<=(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga250eb7cdcb64312f4e2641501dc9baee',1,'operator<=(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f0089cb1db00710fd7233770bc30b60',1,'operator<=(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef2bba33802f57daa91e22602079a3a7',1,'operator<=(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c460da93b4a465dbb65ea6c98d08e0',1,'operator<=(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247f899b55928b075fc919076f5e5949',1,'operator<=(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga914be25957de16f44b85396ba88a7f5d',1,'operator<=(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e5a6258674087258ec46bf94c668353',1,'operator<=(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2dbc819cf82263e9ec490552404734',1,'operator<=(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eff31462c5876d989bad00f346ab183',1,'operator<=(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03fe55d350f74009fef23cbf85c265c4',1,'operator<=(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad73033b2ed798b55ac0e978547e2dcdd',1,'operator<=(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08dfbf27c72c08bc5b257948694cc3e1',1,'operator<=(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7460f2ca99c07231e71c964b4b584ac',1,'operator<=(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b414d7742537f5def6a1f1dbbcee688',1,'operator<=(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a1f07e6149542f2488750c2af3c068',1,'operator<=(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc181ce10142dbd76ee1376a3cd90fdd',1,'operator<=(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40b2bb5b5a77fa89913fb57853cde453',1,'operator<=(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac06f6f101ec8cfcaf490ec6f041a837f',1,'operator<=(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8e0bfab992ab8a121c15af1e82829ac',1,'operator<=(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e24ea99fa24b52f3669e40c16c2a0f7',1,'operator<=(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1e079957fbf820718af8a90067d68a9',1,'operator<=(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93b6391a06707b6be2ca59da57057086',1,'operator<=(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61706e65d948e11d869534a6653c00bf',1,'operator<=(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99abc45e21e9f42fd926a8e83cdab296',1,'operator<=(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba541b96bbc1af333e8a13eb1dc169d',1,'operator<=(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7a9638a0e70f17231a9e10fecedb0b2',1,'operator<=(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga455fe5a0dbcd6e20648e5bc2dd13fd6c',1,'operator<=(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2618b57557803d2ac6d3450904bf7e6',1,'operator<=(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ad206b773be555181e771e60d3d80d',1,'operator<=(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2589f700026397ad0058d21462da1714',1,'operator<=(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac57dc63fcc9e6782a2af19c0a14bf769',1,'operator<=(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5f991c778ac1f18cd26ec9a6ae5ff72',1,'operator<=(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7a1cc2de07b5b85ef8a5b16d01e487b',1,'operator<=(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa452eeb5d53100bd938b7e1bb338d995',1,'operator<=(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987b56ea0c72d063c0556dd6cac14929',1,'operator<=(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9292c118b4add3d2e427413547c585fb',1,'operator<=(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546cd23c9536ca329dbc1c6cccb7497',1,'operator<=(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ec0c62ac154d66d9623f15fdac7c91',1,'operator<=(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f767e3bf13cbd06503128dae485024',1,'operator<=(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e42dbf144296f0d9586569a04f490',1,'operator<=(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga616315867d4da80fdfe8216599b6537e',1,'operator<=(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92fbe24a4d7fc8e87ea5663cad49fcf1',1,'operator<=(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73c4504f2ad38a1eb98bcf0da9989196',1,'operator<=(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga525f070d7c6ab195d7c415794a412214',1,'operator<=(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb29143e8afd81a0c0f520bb43c16b6',1,'operator<=(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cb74c8f5ee39656481d92ba33911254',1,'operator<=(double s, const double4 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a8002d09a2b548cf3abc2bd4aeafbce78',1,'__gnu_cxx::operator<=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a08ad6f0a285af9120e6d882594281672',1,'__gnu_cxx::operator<=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a3672b11b2bb1fc3a4b22f6d29473af87',1,'__gnu_cxx::operator<=(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a930dd0467ade4b159f585b09a918c395',1,'std::operator<=(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8d12abc1fb7e7cd1c53769a0fc5ff75f',1,'std::operator<=(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9e2bd7d69af9d03b7df4858595a3202e',1,'std::operator<=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#adb3e9ff06db8a5cc1105aaea9e01abd2',1,'std::operator<=(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5b152596ab130d1c97908b694e5fd761',1,'std::operator<=(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga6d0ebab63e2fcfb19ad69237091d4d7f',1,'std::operator<=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a54c920ed5017335b380d77d540169c76',1,'std::operator<=(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fd4bec06d2b472f7002ee98aea643af',1,'std::operator<=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gac012e10e6bb4ba58875ad515b9b9f05d',1,'std::operator<=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga490e9054301cbb70120a6b0202cee45d',1,'std::operator<=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5620ce8b20ede9f7494a66af23212304',1,'std::operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga84b53be86a6dfea454c23d5207d0864d',1,'std::operator<=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af19b07884ac9b3b0986b70d79bdc7ec1',1,'std::operator<=(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a407132a3a46dfa53d8f1e7810ee5b54d',1,'std::operator<=(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeb2fd054122ecce964976201c05a73cc',1,'std::operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acc2c10d2a7234cc66fd327a6f65954f7',1,'std::operator<=(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab0de944941fcbe6618dba4837b31deaa',1,'std::operator<=(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8921c2d57c14b7e9702a9500bde8aba9',1,'std::operator<=(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a25c829a4d9c4e577f0b11223bd00aced',1,'std::operator<=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac39a97945b49c71df0816226ff72807f',1,'std::operator<=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a72de11bf9e31d206cda3e333812a3f5a',1,'std::operator<=(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a00e5655f35d242d0995153643aea2ebc',1,'std::__debug::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a513766abdb4ed2ba58d8792147ebf811',1,'std::__profile::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#aaf5340c412fb69ca76ea39d768f04ce4',1,'std::rel_ops::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gae39d9fee6e2bb1642be73a0474be71b3',1,'std::tr2::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gae39d9fee6e2bb1642be73a0474be71b3',1,'operator<=(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga6d0ebab63e2fcfb19ad69237091d4d7f',1,'operator<=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fd4bec06d2b472f7002ee98aea643af',1,'operator<=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gac012e10e6bb4ba58875ad515b9b9f05d',1,'operator<=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga490e9054301cbb70120a6b0202cee45d',1,'operator<=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5620ce8b20ede9f7494a66af23212304',1,'operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga84b53be86a6dfea454c23d5207d0864d',1,'operator<=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeb2fd054122ecce964976201c05a73cc',1,'operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9e2bd7d69af9d03b7df4858595a3202e',1,'operator<=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], - ['operator_3d_340',['operator=',['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a76321e46a6c9fd0cb68c1ecc862cb515',1,'cv::util::any::operator=(any &&)=default'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a825b496ef0087775e11beb91d157d0c8',1,'cv::util::any::operator=(any const &src)'],['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a13709e8c99dac446a1c1ed71798eee72',1,'cv::AsyncArray::operator=()'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#aa39cabdf05e3b14aadee5dec3e7baa0e',1,'cv::AsyncPromise::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'cv::AutoBuffer::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'AutoBuffer< double, 1 >::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'AutoBuffer< int64, 1 >::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'AutoBuffer< String, 1 >::operator=()'],['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#a52a7237f767b8d0269724c481329b6d5',1,'cv::detail::CameraParams::operator=()'],['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#a1b7982e6ea32e8653ae0543ff0a81354',1,'cv::CommandLineParser::operator=()'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a43a8ac6dd8cb0d342d39a65acf402217',1,'cv::ocl::Context::operator=()'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1gapi_1_1wip_1_1Data.html#a3ae38e8c51ce271fab188d7da2272fed',1,'cv::gapi::wip::Data::operator=(const T &t)'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1gapi_1_1wip_1_1Data.html#a5e490199d72c9f1c81663c3225c893d2',1,'cv::gapi::wip::Data::operator=(T &&t)'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a1b0465bff476900efb5ca2f238563997',1,'cv::ocl::Device::operator=()'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#acc5ccf38e7abf268d032074cff8d5cc2',1,'cv::dnn::DictValue::operator=()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7b1a3493d50b1d4fb636aa1550cdce34',1,'cv::FileNode::operator=()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#aeffb68f308d077062d0ced1a57ebd489',1,'cv::FileNodeIterator::operator=()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ad1432eed28a34f995a641a296281e01c',1,'cv::cuda::GpuMat::operator=()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a3e2a15bc4185f48943ed354e1b927ad6',1,'cv::cudev::GpuMat_::operator=(const GpuMat_ &m)'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a6075adc7a8150ea7069235c7793b7c69',1,'cv::cudev::GpuMat_::operator=(const Expr< Body > &expr)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a086c7947f5c106c9b238ba9dcbcb2f1c',1,'cv::cuda::HostMem::operator=()'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#a1034c0afe903b367b0f47c1916d9616f',1,'cv::ocl::Image2D::operator=()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#aa2694f462b29140fd21bc0e6f5380f0b',1,'cv::ocl::Kernel::operator=()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aed1f81fe7efaacc2bd95149cdfa34302',1,'cv::Mat::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a2a0798475170fb3a23b5bc63686de334',1,'cv::Mat::operator=(const MatExpr &expr)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa5c947f7e449a4d856a4f3a87fcebd50',1,'cv::Mat::operator=(const Scalar &s)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a86d190d68dbd801a2bd555d0905979fd',1,'cv::Mat::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a125f510bec573808666906a95ea09cb4',1,'cv::gapi::own::Mat::operator=(Mat const &src)=default'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#aa9caec4b6b0cf0f7ae8bb7808154d594',1,'cv::gapi::own::Mat::operator=(Mat &&src)=default'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a3709c060fa62e45132ab1932a73803c8',1,'cv::gapi::own::Mat::operator=(const Scalar &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'cv::Mat_::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'cv::Mat_::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'cv::Mat_::operator=(const _Tp &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'cv::Mat_::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'cv::Mat_::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'cv::Mat_::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< double >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< double >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< double >::operator=(const double &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< double >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< double >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< double >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< float >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< float >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< float >::operator=(const float &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< float >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< float >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< float >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< uchar >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< uchar >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< uchar >::operator=(const uchar &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< uchar >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< uchar >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< uchar >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< unsigned char >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< unsigned char >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< unsigned char >::operator=(const unsigned char &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< unsigned char >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< unsigned char >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< unsigned char >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#ae5b2d39c2deb60c6db6202034e28182d',1,'cv::detail::MatchesInfo::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#af1c80909af2a28c1b98c6bf1f53984d7',1,'cv::MatConstIterator::operator=()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#af7430e2fa55817bdd66753a5af7f3242',1,'cv::MatConstIterator_::operator=()'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#af31e606676d1cd6bdeedcbdd1ea4fb41',1,'cv::gapi::own::detail::MatHeader::operator=(const MatHeader &)=default'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#ac6efb1a462a75da9fad1c38cbbc99bac',1,'cv::gapi::own::detail::MatHeader::operator=(MatHeader &&src)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a531046b556e382f91c55e3076083f051',1,'cv::MatIterator_::operator=()'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a325af086a8a2a9be290ca92d3b4946c5',1,'cv::MatStep::operator=(size_t s)'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a9927dacc19715875bf7518207445e0ad',1,'cv::MatStep::operator=(const MatStep &)'],['https://docs.opencv.org/4.2.0/d7/dc2/classcv_1_1instr_1_1NodeData.html#af66d2f09b331f5de963a2cfa0d7ba21e',1,'cv::instr::NodeData::operator=()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a2e6daae54312f1bbe7a832e8083a7af9',1,'cv::util::optional::operator=(const optional &rhs)=default'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a11564f1271c6c1aa95c98ba7385c6779',1,'cv::util::optional::operator=(optional &&rhs)'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#ad7a69d27e55090b7019236b251d57a81',1,'cv::ocl::Platform::operator=()'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#ad25bce73d8db1173fd08fe631e2a2389',1,'cv::ocl::PlatformInfo::operator=()'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a892446cde2db30f149f572b92619dc9f',1,'cv::Point3_::operator=(const Point3_ &pt)'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a272296b0541449dbe926deb557f18fa7',1,'cv::Point3_::operator=(Point3_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'cv::Point_::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'cv::Point_::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'Point_< double >::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'Point_< double >::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'Point_< float >::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'Point_< float >::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'Point_< int >::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'Point_< int >::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a9d76780ecc8d97fe76ef926123c507c0',1,'cv::ocl::Program::operator=()'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#ac472f17bd1ee3bab677b38e773d82638',1,'cv::ocl::ProgramSource::operator=()'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#acaf2d9afbd65c6ade583f73a2c5023e5',1,'cv::ocl::Queue::operator=()'],['https://docs.opencv.org/4.2.0/d3/d22/classcv_1_1gapi_1_1own_1_1Rect.html#aca0529ecae368b5027176331f4257bd4',1,'cv::gapi::own::Rect::operator=()'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#ab9b239b3562b94f07e46551d05af97c6',1,'cv::Rect_::operator=(const Rect_ &r)'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a8228f59c183fca9695ae329dc773a3e1',1,'cv::Rect_::operator=(Rect_ &&r) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ad95d917b9fb9a0053929b2b5c84bb5b2',1,'cv::Scalar_::operator=(const Scalar_ &s)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a8ea9d461de3c6e04f64c2f2ee1751cd2',1,'cv::Scalar_::operator=(Scalar_ &&s) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ad95d917b9fb9a0053929b2b5c84bb5b2',1,'Scalar_< double >::operator=(const Scalar_ &s)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a8ea9d461de3c6e04f64c2f2ee1751cd2',1,'Scalar_< double >::operator=(Scalar_ &&s) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#aa126ea44724ae43d1fc1597397d9b3f5',1,'cv::gapi::own::Size::operator=()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a7a115285576d3211b24bda4628ee7f4d',1,'cv::Size_::operator=(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#aa7a87199e67360f44636ec30b1183fcd',1,'cv::Size_::operator=(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a7a115285576d3211b24bda4628ee7f4d',1,'Size_< float >::operator=(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#aa7a87199e67360f44636ec30b1183fcd',1,'Size_< float >::operator=(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf80704eb7bfc3257da30ad5a82fb9de',1,'cv::softdouble::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9451cdb3a66bebcc1f5e8b409f780b7f',1,'cv::softfloat::operator=()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a144c0f1ec1d3ffc20305bc4d1747b741',1,'cv::SparseMat::operator=(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a9e634f2d73a077444df4395e50821129',1,'cv::SparseMat::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#aa9ea60ee22d3ba75ccb16365eda3f096',1,'cv::SparseMat_::operator=(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a3a90de6441880eae3ba875a0fed2700e',1,'cv::SparseMat_::operator=(const SparseMat_ &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#aebaca1182543e7e71ee5c4f73a088c90',1,'cv::SparseMat_::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a9ad2aca73fd447e5642b1c21bd978cd3',1,'cv::SparseMatConstIterator::operator=()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#afe543867ec13099311670ad837eab611',1,'cv::SparseMatConstIterator_::operator=()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a69fe44b15c6618424367d24b8b99b9e4',1,'cv::SparseMatIterator::operator=()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#ad1d385d5c83a9c1104e9a197e331881c',1,'cv::SparseMatIterator_::operator=()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aac5e0ed13076c2371fa41d215a49b17f',1,'cv::UMat::operator=(const UMat &m)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a245c83dba9f05fc44d44d557f86101f1',1,'cv::UMat::operator=(const Scalar &s)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a561c1a335882bfe799e4235ee8fb67a6',1,'cv::UMat::operator=(UMat &&m)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a06701f71c52af321d833f6f3fdcfb89f',1,'cv::util::variant::operator=(const variant &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#abcd060a1b68f44893b2f15547f46b1d1',1,'cv::util::variant::operator=(variant &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a5d690841b784f348c9db1e741de8be0e',1,'cv::util::variant::operator=(T &&t) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a37e79528fb523179954532c12afb3e5b',1,'cv::util::variant::operator=(const variant< Ts... > &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a0f2388dd0dd28e24b5842cd1b432008c',1,'cv::util::variant::operator=(variant< Ts... > &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a06701f71c52af321d833f6f3fdcfb89f',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(const variant &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#abcd060a1b68f44893b2f15547f46b1d1',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(variant &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a5d690841b784f348c9db1e741de8be0e',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(T &&t) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a37e79528fb523179954532c12afb3e5b',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(const variant< Ts... > &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a0f2388dd0dd28e24b5842cd1b432008c',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(variant< Ts... > &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#afced2add96752159cd3a20f7592a528f',1,'cv::viz::Viz3d::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#a32e9fb3b4821e9aa0163c54fdcb8ce3c',1,'cv::viz::Widget::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a7bee901f7465419633250caa04983ef6',1,'__gnu_cxx::__versa_string::operator=(const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a46713802e19d9139db7468030060ebaf',1,'__gnu_cxx::__versa_string::operator=(__versa_string &&__str) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aa833376e55c1b6c75179e976043e6dd6',1,'__gnu_cxx::__versa_string::operator=(std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a01f0f4f2476992da89a882cb4f35c52e',1,'__gnu_cxx::__versa_string::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aa1d106b3b5ff8313d6d646f9aec5adc6',1,'__gnu_cxx::__versa_string::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#ae0afa6ce3f2e1d626b46ad157edb0a39',1,'__gnu_debug::_Safe_iterator::operator=(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a8289e4e52eca797212f8ed2f7ac06484',1,'__gnu_debug::_Safe_iterator::operator=(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#aa7d1bbc86a00f5af9a96cc55c7914cce',1,'__gnu_debug::_Safe_local_iterator::operator=(const _Safe_local_iterator &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a63641a3d3e09e8c2ef28e47d9f4b6057',1,'__gnu_debug::_Safe_local_iterator::operator=(_Safe_local_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#ae0afa6ce3f2e1d626b46ad157edb0a39',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator=(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a8289e4e52eca797212f8ed2f7ac06484',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator=(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#ae0afa6ce3f2e1d626b46ad157edb0a39',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator=(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a8289e4e52eca797212f8ed2f7ac06484',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator=(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< _CharT >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< _CharT >::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< _CharT >::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< _CharT >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< _CharT >::operator=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(_Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< char >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< char >::operator=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< char >::operator=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< char >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< char >::operator=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< char_type, _Traits, _Alloc >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< char_type, _Traits, _Alloc >::operator=(const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< char_type, _Traits, _Alloc >::operator=(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< char_type, _Traits, _Alloc >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< char_type, _Traits, _Alloc >::operator=(initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< value_type >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< value_type >::operator=(const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< value_type >::operator=(value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< value_type >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< value_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#acbbd2ced11be9e416c030bf3dcaeacad',1,'deque< _StateSeqT >::operator=(const deque &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a77734a257fa1c71752517d0ae6ae707d',1,'deque< _StateSeqT >::operator=(deque &&__x) noexcept(_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a74898d8b495f47ced979e6ba66c4eef1',1,'deque< _StateSeqT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a35a994d029c0e0cf92abf1f468cfa140',1,'list< __inp, __rebind_inp >::operator=(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8f9b65b72c23e8c124c5f4a6e11013e0',1,'list< __inp, __rebind_inp >::operator=(list &&__x) noexcept(_Node_alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b554a6eab6e57e565eedb7da72a83c5',1,'list< __inp, __rebind_inp >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aaa530908380c41e867d3d3d8d6dcf017',1,'match_results< _Bi_iter >::operator=(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a9066bb40864217bcf43710d9ea95bd86',1,'match_results< _Bi_iter >::operator=(match_results &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04755.html#af6ed2d0a405aee06f81dda8452a6e2ce',1,'std::__allocated_ptr::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#af798a3136d8030f2158837fde7373f5b',1,'std::auto_ptr::operator=(auto_ptr &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#adf78f102f371538dbe78a57976053736',1,'std::auto_ptr::operator=(auto_ptr< _Tp1 > &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#aa94f823e79ee65ed66fe128448d434ef',1,'std::back_insert_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a232af3b8f7c72e6c67ba9f3b6d1b256d',1,'std::basic_regex::operator=(const basic_regex &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a8d6c69a28d8c523cae6f7322095490d5',1,'std::basic_regex::operator=(basic_regex &&__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#aaf3c150b855c8dddc84f7a33519dba7f',1,'std::basic_regex::operator=(const _Ch_type *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#ae9f733548bcdaf906573129bed9c10fa',1,'std::basic_regex::operator=(initializer_list< _Ch_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a85898504e41caa15dfed44321f36c4c9',1,'std::basic_regex::operator=(const basic_string< _Ch_type, _Ch_traits, _Alloc > &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'std::basic_string::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'std::basic_string::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'std::basic_string::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'std::basic_string::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'std::basic_string::operator=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga92ff752125c60794c33d55db59b48105',1,'std::complex::operator=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaebc147a1a3a6e326215cd323aafa6bc6',1,'std::complex::operator=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#acbbd2ced11be9e416c030bf3dcaeacad',1,'std::deque::operator=(const deque &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a77734a257fa1c71752517d0ae6ae707d',1,'std::deque::operator=(deque &&__x) noexcept(_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a74898d8b495f47ced979e6ba66c4eef1',1,'std::deque::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a146ce22d8e7f66b46766d6de66fb6584',1,'std::experimental::fundamentals_v1::any::operator=(const any &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a0453d90a8d4fb2325712c4e5f3b909a7',1,'std::experimental::fundamentals_v1::any::operator=(any &&__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#af377e421f8e38d5873afb4d84aab606b',1,'std::experimental::fundamentals_v1::any::operator=(_ValueType &&__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a78c1273fb53228cab655addd77f9cd25',1,'std::forward_list::operator=(const forward_list &__list)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aaedecd0634ab8c057cca203778ea6cfa',1,'std::forward_list::operator=(forward_list &&__list) noexcept(_Node_alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a6b8dfcf0c3aad308699e909186c39f2b',1,'std::forward_list::operator=(std::initializer_list< _Tp > __il)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#ad88a7eabbaf51cfa7c8152e1c27d226f',1,'std::front_insert_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a698ecd83665a25c0c1f9cbe2ea85c2a0',1,'std::function< _Res(_ArgTypes...)>::operator=(const function &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a00bb39127d1936767cbfd81c4bb02354',1,'std::function< _Res(_ArgTypes...)>::operator=(function &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a05ea81faa27f6b5511b699634b83c4a8',1,'std::function< _Res(_ArgTypes...)>::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#afbb6bdd269617d2793d4dbbb078f6707',1,'std::function< _Res(_ArgTypes...)>::operator=(_Functor &&__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#afc4ca535d5508c13e9112b39c8c064d4',1,'std::function< _Res(_ArgTypes...)>::operator=(reference_wrapper< _Functor > __f) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga59fd646ebf243e99b2063baf37ba91d0',1,'std::gslice::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf25507c9a66f729500964d397b7cb9fb',1,'std::gslice_array::operator=(const gslice_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf2a0c3883cfb758e05e3d62ec7e0a07f',1,'std::gslice_array::operator=(const valarray< _Tp > &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8dfed8c043d7a82e4b71cf65c64ec844',1,'std::gslice_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga73cce032d98e922eeafb676920174f52',1,'std::indirect_array::operator=(const indirect_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6072ae14d756314665aef25c55cc4d33',1,'std::indirect_array::operator=(const valarray< _Tp > &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac17dafc8657c7fd6eab36a46260ff97f',1,'std::indirect_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a97b27e02a31008441dd0374c6a1021e4',1,'std::insert_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a35a994d029c0e0cf92abf1f468cfa140',1,'std::list::operator=(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8f9b65b72c23e8c124c5f4a6e11013e0',1,'std::list::operator=(list &&__x) noexcept(_Node_alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b554a6eab6e57e565eedb7da72a83c5',1,'std::list::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a21b4d6ac8a3c4614656b67eec61b5f9d',1,'std::locale::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a0ffbbf85c084d61ab49c7fec028bafba',1,'std::map::operator=(const map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a28b4c4feee2bbdf398540f4097d4bb91',1,'std::map::operator=(map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ac01f44f3ed4b9dbebcb046b4103f920c',1,'std::map::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac8928f66422bd3601fcf43b79761abd5',1,'std::mask_array::operator=(const mask_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2af95af73e734b394322ec304e1b73f2',1,'std::mask_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aaa530908380c41e867d3d3d8d6dcf017',1,'std::match_results::operator=(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a9066bb40864217bcf43710d9ea95bd86',1,'std::match_results::operator=(match_results &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#acd76a5f8a95e15654c8e61c55f1fdc61',1,'std::multimap::operator=(const multimap &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#aebc9eaf75029cfb33e4121a75a875713',1,'std::multimap::operator=(multimap &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a069fcb3baa5b568196b04950e380b865',1,'std::multimap::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a20d46cd310dd519085bca08a77ca0116',1,'std::multiset::operator=(const multiset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a572d0693c78910dc45ba3a5374066f7d',1,'std::multiset::operator=(multiset &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a92ec8ff818ef21f8d170842d4732299c',1,'std::multiset::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02635.html#adbefc6681906783e9e20249895a98082',1,'std::once_flag::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a3c5547f8d577192a0c4672ef08a1b166',1,'std::ostream_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#abcdedbb3c0f65a77d78cd15466ec7c73',1,'std::ostreambuf_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a86764099987b135d0966eda405b99de8',1,'std::regex_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a7701c80539dd9bb567d519151fe0484f',1,'std::regex_token_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a8ffd6bc39d7e301ec0f77568e4c531c2',1,'std::set::operator=(const set &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#afc8c71ffd02970fa13cd6f6fbd40682b',1,'std::set::operator=(set &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a8e269a4d9e589df1ef1bc6df659e7a96',1,'std::set::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga638dcc09b7202f5e671c6637bf01db31',1,'std::slice_array::operator=(const slice_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab5edb43da924e3c138ba22d29dc4c050',1,'std::slice_array::operator=(const valarray< _Tp > &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga3ddb6f583d7c7ef17b471662a4a7a7ac',1,'std::slice_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a0aa055c3e0b3e447ea378c5982952d20',1,'std::tr2::dynamic_bitset::operator=(const dynamic_bitset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a617447d4740d9204992d8119a838aff7',1,'std::tr2::dynamic_bitset::operator=(dynamic_bitset &&__b) noexcept(std::is_nothrow_move_assignable< _Base >::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'std::unique_ptr::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'std::unique_ptr::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'std::unique_ptr::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a6591772e73b9c09f47f348484995e811',1,'std::unique_ptr< _Tp[], _Dp >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#ac4e60274f821a367b846aaf799897792',1,'std::unique_ptr< _Tp[], _Dp >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#ac873de4914a9d9182497101f8c66ac10',1,'std::unique_ptr< _Tp[], _Dp >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aca0525353d274a1abca19e123ca58702',1,'std::unordered_map::operator=(const unordered_map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d63494d15ed6c47df072d06d9608ca0',1,'std::unordered_map::operator=(unordered_map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a46087d4d85698c13e7fe5e10f13821d1',1,'std::unordered_map::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a04b3ff006b08f143403c12e743ced9b6',1,'std::unordered_multimap::operator=(const unordered_multimap &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac9f4a7b990b045b2709562eb6b7f9328',1,'std::unordered_multimap::operator=(unordered_multimap &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a1dd84e27aa97a782f79e757eadcd5461',1,'std::unordered_multimap::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a9e17536caf4f009c1a337cbdc65b10e4',1,'std::unordered_multiset::operator=(const unordered_multiset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#abc404eb73cb8ffa4efb906fd400e476b',1,'std::unordered_multiset::operator=(unordered_multiset &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#adfc21fb29e21a666c726325bdbab7fd8',1,'std::unordered_multiset::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a28b4eb4e12733c87d05ecd05c23e4269',1,'std::unordered_set::operator=(const unordered_set &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae40948838a04772d6e2e0281ccbde1f3',1,'std::unordered_set::operator=(unordered_set &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a3c34d8e0d4bfc8c91c4b54b5199edc04',1,'std::unordered_set::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafd9682220fbb71cdd3780fb0b80a7840',1,'std::valarray::operator=(const valarray< _Tp > &__v)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0b40ea6b05b21b6506d3541205bbfe64',1,'std::valarray::operator=(valarray< _Tp > &&__v) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga80a24d05a21101fb1e8f32d7617b349a',1,'std::valarray::operator=(const _Tp &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga708c338c38f644c83fb4440add0a7f82',1,'std::valarray::operator=(const slice_array< _Tp > &__sa)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga975285295867516982cbd04e5416ca33',1,'std::valarray::operator=(const gslice_array< _Tp > &__ga)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga008f37655c6e6e55b37c9b46efd259c1',1,'std::valarray::operator=(const mask_array< _Tp > &__ma)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad58ef4619934cdeccb9b476c6e8ccceb',1,'std::valarray::operator=(const indirect_array< _Tp > &__ia)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga781c3cfba5752871b9b8df2717f3d301',1,'std::valarray::operator=(initializer_list< _Tp > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'std::vector::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'std::vector::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'std::vector::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Codecvt >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Codecvt >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Codecvt >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Res_type >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Res_type >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Res_type >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Result< _Res > >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Result< _Res > >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Result< _Res > >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Result_base >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Result_base >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Result_base >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< bool[]>::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< bool[]>::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< bool[]>::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aca0525353d274a1abca19e123ca58702',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator=(const unordered_map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d63494d15ed6c47df072d06d9608ca0',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator=(unordered_map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a46087d4d85698c13e7fe5e10f13821d1',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafd9682220fbb71cdd3780fb0b80a7840',1,'valarray< size_t >::operator=(const valarray< size_t > &__v)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0b40ea6b05b21b6506d3541205bbfe64',1,'valarray< size_t >::operator=(valarray< size_t > &&__v) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga80a24d05a21101fb1e8f32d7617b349a',1,'valarray< size_t >::operator=(const size_t &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga708c338c38f644c83fb4440add0a7f82',1,'valarray< size_t >::operator=(const slice_array< size_t > &__sa)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga975285295867516982cbd04e5416ca33',1,'valarray< size_t >::operator=(const gslice_array< size_t > &__ga)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga008f37655c6e6e55b37c9b46efd259c1',1,'valarray< size_t >::operator=(const mask_array< size_t > &__ma)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad58ef4619934cdeccb9b476c6e8ccceb',1,'valarray< size_t >::operator=(const indirect_array< size_t > &__ia)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga781c3cfba5752871b9b8df2717f3d301',1,'valarray< size_t >::operator=(initializer_list< size_t > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< __diff_type >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< __diff_type >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< __diff_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _CharClassT >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _CharClassT >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _CharClassT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _CharT >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _CharT >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _CharT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _Cmpt >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _Cmpt >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _Cmpt >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _Node *, _Nodeptr_Alloc >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _Node *, _Nodeptr_Alloc >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _Node *, _Nodeptr_Alloc >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _RealType >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _RealType >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _RealType >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _State< _TraitsT::char_type > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _State< _TraitsT::char_type > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _State< _TraitsT::char_type > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _StringT >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _StringT >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _StringT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< block_type, allocator_type >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< block_type, allocator_type >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< block_type, allocator_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< Catalog_info * >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< Catalog_info * >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< Catalog_info * >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< double >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< double >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< double >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< int >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< int >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< int >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< result_type >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< result_type >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< result_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< size_t >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< size_t >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< size_t >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< std::pair< _BiIter, int > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< std::pair< _BiIter, int > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< std::pair< _BiIter, int > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< std::pair< _StateIdT, std::vector > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< std::pair< _StateIdT, std::vector > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< std::pair< _StateIdT, std::vector > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< sub_match< _BiIter >, _Alloc >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< sub_match< _BiIter >, _Alloc >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< sub_match< _BiIter >, _Alloc >::operator=(initializer_list< value_type > __l)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a61747e22cfd8bd36456de2deed877fca',1,'Eigen::AngleAxis::operator=(const MatrixBase< Derived > &mat)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#aa79ba9655d1b8fe12d75082902cea88b',1,'Eigen::AngleAxis::operator=(const QuaternionBase< QuatDerived > &q)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Eigen::Array::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Eigen::Array::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Eigen::Array::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Eigen::Array::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< double, DPARM_SIZE, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< double, DPARM_SIZE, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< double, DPARM_SIZE, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< double, DPARM_SIZE, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< Index, 1, Dynamic >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< Index, 1, Dynamic >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< Index, 1, Dynamic >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< Index, 1, Dynamic >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< int, IPARM_SIZE, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< int, IPARM_SIZE, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< int, IPARM_SIZE, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< int, IPARM_SIZE, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< RealScalar, Dynamic, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< RealScalar, Dynamic, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< RealScalar, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< RealScalar, Dynamic, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< StorageIndex, 2, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< StorageIndex, 2, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< StorageIndex, 2, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< StorageIndex, 2, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a8587d8d893f5225a4511e9d76d9fe3cc',1,'Eigen::ArrayBase::operator=(const ArrayBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a80cacb05b6881fba659efb2377e4fd22',1,'Eigen::ArrayBase::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a8587d8d893f5225a4511e9d76d9fe3cc',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator=(const ArrayBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a80cacb05b6881fba659efb2377e4fd22',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'Eigen::DenseBase::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'Eigen::DenseBase::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'Eigen::DenseBase::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'DenseBase< Solve< Decomposition, RhsType > >::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'DenseBase< Solve< Decomposition, RhsType > >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'DenseBase< Solve< Decomposition, RhsType > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a5d362adc0550baabcff2095c92c5045d',1,'Eigen::DiagonalMatrix::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Eigen::Matrix::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Eigen::Matrix::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Eigen::Matrix::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< RealScalar, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< RealScalar, Dynamic, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< RealScalar, Dynamic, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, 3, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, 3, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, 3, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Dim, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Dim, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Dim, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Dynamic, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Dynamic, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< StorageIndex, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< StorageIndex, Dynamic, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< StorageIndex, Dynamic, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a373bf62ad398162df5a71963ed7cbeff',1,'Eigen::MatrixBase::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a373bf62ad398162df5a71963ed7cbeff',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a373bf62ad398162df5a71963ed7cbeff',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'Eigen::PermutationBase::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'Eigen::PermutationBase::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'Eigen::PermutationMatrix::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'Eigen::PermutationMatrix::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'Eigen::PlainObjectBase::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'Eigen::PlainObjectBase::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'Eigen::QuaternionBase::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'Eigen::QuaternionBase::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a9d3da523c37f4ef0574f35fd7b3b9662',1,'Eigen::Rotation2D::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolExpr.html#a0bd43167911dc398fba4e3f0f142a64d',1,'Eigen::symbolic::SymbolExpr::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a826047489741a19b81c6552f8257b1cf',1,'Eigen::Transform::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a8ed8318285ccc7498197da7df1273bd5',1,'Eigen::Transform::operator=(const QMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a54986164dcb1d0f7bfa216b8ef5272f6',1,'Eigen::Transform::operator=(const QTransform &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a991cbd0dcd647b414bbfdbacb642dbbd',1,'Eigen::Transpositions::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a991cbd0dcd647b414bbfdbacb642dbbd',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a09db8ccbd4b2da7c7e8d520458166cc1',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator=(const MatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a556c7e90c64e86a3a8e722989dda1bc6',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator=(const TriangularBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'Eigen::VectorwiseOp::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Derived, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Derived, Vertical >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a1ae937c299f347a9dcb7f31a8e57762b.html#a1ae937c299f347a9dcb7f31a8e57762b',1,'nlohmann::basic_json::operator=()'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a1a90dae111cf189ac9ad340a60b199b6.html#a1a90dae111cf189ac9ad340a60b199b6',1,'nlohmann::json_sax::operator=(const json_sax &)=default'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_ac74584e3dc41f2465e69b37d7d2bf694.html#ac74584e3dc41f2465e69b37d7d2bf694',1,'nlohmann::json_sax::operator=(json_sax &&) noexcept=default'],['../classcam_1_1CameraParams.html#a7a73a289f11757797b23d816e2561dae',1,'cam::CameraParams::operator=()'],['../classrobot_1_1base__motor.html#a354ebc41c91a7f98c7b3b8cf8bfd145f',1,'robot::base_motor::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9451cdb3a66bebcc1f5e8b409f780b7f',1,'operator=(const softfloat &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf80704eb7bfc3257da30ad5a82fb9de',1,'operator=(const softdouble &c)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga92ff752125c60794c33d55db59b48105',1,'operator=(const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaebc147a1a3a6e326215cd323aafa6bc6',1,'operator=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf25507c9a66f729500964d397b7cb9fb',1,'operator=(const gslice_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga73cce032d98e922eeafb676920174f52',1,'operator=(const indirect_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac8928f66422bd3601fcf43b79761abd5',1,'operator=(const mask_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf2a0c3883cfb758e05e3d62ec7e0a07f',1,'operator=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga59fd646ebf243e99b2063baf37ba91d0',1,'operator=(const gslice &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8dfed8c043d7a82e4b71cf65c64ec844',1,'operator=(const _Tp &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga638dcc09b7202f5e671c6637bf01db31',1,'operator=(const slice_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0b40ea6b05b21b6506d3541205bbfe64',1,'operator=(valarray< _Tp > &&__v) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga708c338c38f644c83fb4440add0a7f82',1,'operator=(const slice_array< _Tp > &__sa)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga975285295867516982cbd04e5416ca33',1,'operator=(const gslice_array< _Tp > &__ga)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga008f37655c6e6e55b37c9b46efd259c1',1,'operator=(const mask_array< _Tp > &__ma)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad58ef4619934cdeccb9b476c6e8ccceb',1,'operator=(const indirect_array< _Tp > &__ia)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga781c3cfba5752871b9b8df2717f3d301',1,'operator=(initializer_list< _Tp > __l)(Global Namespace)']]], - ['operator_3d_3d_341',['operator==',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#acf112fc545f9775e075edc49aba223c4',1,'cv::FileNodeIterator::operator==(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#acf112fc545f9775e075edc49aba223c4',1,'cv::FileNodeIterator::operator==(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/dd5/structcv_1_1GArrayDesc.html#aa68591702df8e965af25f67215b9a025',1,'cv::GArrayDesc::operator==()'],['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html#aa6626bdd5f1f55a5f29bad91cf8b891b',1,'cv::gapi::GBackend::operator==()'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a15c5b7fd785e239a1863f4658c1c53ac',1,'cv::GMatDesc::operator==()'],['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#a1f2bff8899fd6b72e574d48194bf283b',1,'cv::optflow::GPCTree::operator==()'],['https://docs.opencv.org/4.2.0/d1/d6a/structcv_1_1GScalarDesc.html#a36bdb1c38855e657126b600da4befb61',1,'cv::GScalarDesc::operator==()'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a90841129d2fa56dc7713e51d668dd8b5',1,'cv::linemod::Match::operator==()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0f25efd0c1f254692fc60bda5f4c3353',1,'cv::MatExpr::operator==(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5516de530ce49cf1fdbfcedbc13fa64d',1,'cv::MatExpr::operator==(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2c23e8205bea3a64497638fe270e3a83',1,'cv::MatExpr::operator==(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab9e92650570e38003f74364c0d168157',1,'cv::MatExpr::operator==(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abb139508b5df77d1009612b438f53df5',1,'cv::MatExpr::operator==(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0f25efd0c1f254692fc60bda5f4c3353',1,'cv::MatExpr::operator==(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5516de530ce49cf1fdbfcedbc13fa64d',1,'cv::MatExpr::operator==(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2c23e8205bea3a64497638fe270e3a83',1,'cv::MatExpr::operator==(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab9e92650570e38003f74364c0d168157',1,'cv::MatExpr::operator==(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abb139508b5df77d1009612b438f53df5',1,'cv::MatExpr::operator==(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#ae19097bf50bc486e072f340a295adb64',1,'cv::MatSize::operator==()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'cv::Matx::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'cv::Matx::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< _Tp, cn, 1 >::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< _Tp, cn, 1 >::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 1, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 1, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 2 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 2 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 4, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 4, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, cn, 1 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, cn, 1 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 2, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 2, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 3, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 3, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, cn, 1 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, cn, 1 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float_type, 4, 4 >::operator==(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float_type, 4, 4 >::operator==(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/d8/dde/structNcvSize32u.html#a447699c291cd1eb0786f1ee3b1570fb6',1,'NcvSize32u::operator==()'],['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#a30538c00fc6f3108318e8dea59aca435',1,'cv::optflow::GPCTree::Node::operator==()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a6c4889ee703a2b667df1fa298ffa312f',1,'cv::RNG::operator==()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga972dee821ab26d61f11528b427131083',1,'cv::softdouble::operator==()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf9ae987f5788edbe1aada59dd7f41717',1,'cv::softfloat::operator==()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a22b988f35c68ef6dda4395640dd00d45',1,'cv::util::variant::operator=='],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a22b988f35c68ef6dda4395640dd00d45',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7acc944a17c34a7e6a1f46a18319abe7',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7acc944a17c34a7e6a1f46a18319abe7',1,'__gnu_pbds::detail::bin_search_tree_node_it_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#a49be997a654cf31a5688f876b3a0926b',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator==(const binary_heap_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a086ba257226b242633bc6519023da110',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator==(const binary_heap_point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a086ba257226b242633bc6519023da110',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#ae75829a8ccd781a3914acd4e19e3ce3e',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator==(const left_child_next_sibling_heap_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a0a47dab89d7acfb414046e40887e3064',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator==(const left_child_next_sibling_heap_node_point_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a0a47dab89d7acfb414046e40887e3064',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a46409e64d8adbfd9be6a641313d150da',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a46409e64d8adbfd9be6a641313d150da',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a71de2ddc1c6ba25e6e272c9da3a95318',1,'const_iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a866b2f6450ebeaa95ed1b6065451ad7d',1,'const_iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ab60504a4db8724aede12258da566aede',1,'gamma_distribution< double >::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ab60504a4db8724aede12258da566aede',1,'gamma_distribution< result_type >::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a71de2ddc1c6ba25e6e272c9da3a95318',1,'iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a866b2f6450ebeaa95ed1b6065451ad7d',1,'iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a96c6f6aabca5106a2db6ecc834bbddfe',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#afaafdb22ede1508109622f89f50e213d',1,'normal_distribution< double >::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#afaafdb22ede1508109622f89f50e213d',1,'normal_distribution< result_type >::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a71de2ddc1c6ba25e6e272c9da3a95318',1,'point_const_iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a866b2f6450ebeaa95ed1b6065451ad7d',1,'point_const_iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#adfa598f9d27ae43c69743fa39fd49a05',1,'point_iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#aa326cdd6985b3c513e13027a420cc8d8',1,'point_iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05507.html#a3c683932c804fc4b5bc8fe9fd379733b',1,'std::_Fwd_list_const_iterator::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05503.html#a3c683932c804fc4b5bc8fe9fd379733b',1,'std::_Fwd_list_iterator::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#a30ec495579b2c991c5eb5259ad4f1704',1,'std::bernoulli_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a98cae54fe8bdfb6ad29aa3577b02e50c',1,'std::binomial_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#affef282a5c1dde27d67a3ad667936c17',1,'std::bitset::operator==(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#affef282a5c1dde27d67a3ad667936c17',1,'std::bitset::operator==(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#a9df65ecb32574bdf021bd67b12ad772f',1,'std::cauchy_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a691feda4d6a0dec975dbe07c838768b6',1,'std::chi_squared_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#aa991a227519aedc1fb7b50798612f94c',1,'std::discard_block_engine::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a61bdfdd7dbb86dc1e5b16f008f9131ae',1,'std::discrete_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#acb5724229a97210048c27dba8f3a50b4',1,'std::exponential_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#afdd72be1506ac50b8909ca3cb57b8bfa',1,'std::extreme_value_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a6d91b2687b4f8cc34d02a65b739ed070',1,'std::fisher_f_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ab60504a4db8724aede12258da566aede',1,'std::gamma_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a63cafb50acfe1b10c4a26cd6c990bc3f',1,'std::geometric_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#ab5791f2acb5c5700ef1e339bfc166d89',1,'std::independent_bits_engine::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#ab062526efb78cd1480aff1eb1544b341',1,'std::linear_congruential_engine::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a0f58972cf0b98da7d1e751bba3f28f7e',1,'std::locale::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#a2e49cbc5eaeb0e2ee18688adb7faff49',1,'std::lognormal_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a96c6f6aabca5106a2db6ecc834bbddfe',1,'std::mersenne_twister_engine::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#ae83e101d008cf6d901327839147b59e8',1,'std::negative_binomial_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#afaafdb22ede1508109622f89f50e213d',1,'std::normal_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a8f919cbe6f2774eb3102708b0590c706',1,'std::piecewise_constant_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#aaecc7ad95a1725574e6beae781d34127',1,'std::piecewise_linear_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a97a69ac6a7f5db9c986887cac931ce85',1,'std::poisson_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#adb0c9c95d8d972b0f68da2b1740bbc14',1,'std::regex_iterator::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a075cbb0e00f38573d223b5590ac9c438',1,'std::regex_token_iterator::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#ac60decfccc6547c45fe37a9cf0cb23f0',1,'std::shuffle_order_engine::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a50ff04920a1b422339cdf87368d1bb36',1,'std::student_t_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#aad723b232704ecb9396af450f399eb1f',1,'std::subtract_with_carry_engine::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a7f0e34979e94f5145c2092483ee0fca9',1,'std::uniform_int_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#a97a14cea3172313b1d430685a13e3dee',1,'std::uniform_real_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a8089e164041723abdb970621d267e7d5',1,'std::weibull_distribution::operator=='],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a80e3e1e83fdf43f9f7fb6ff51836b24d',1,'Eigen::MatrixBase::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a80e3e1e83fdf43f9f7fb6ff51836b24d',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a80e3e1e83fdf43f9f7fb6ff51836b24d',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'Eigen::QuaternionBase::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator==()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a122640e7e2db1814fc7bbb3c122ec76e.html#a122640e7e2db1814fc7bbb3c122ec76e',1,'nlohmann::basic_json::operator=='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a107a085c92ec4e062d1185b2d09c7978.html#a107a085c92ec4e062d1185b2d09c7978',1,'nlohmann::basic_json::operator=='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a24ae7acd5b06ae49cfe1c94633436b68.html#a24ae7acd5b06ae49cfe1c94633436b68',1,'nlohmann::basic_json::operator=='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_aee67fde9d3d571a07d5bb35df21c0555.html#aee67fde9d3d571a07d5bb35df21c0555',1,'nlohmann::byte_container_with_subtype::operator==()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a4667ef558c8c3f8a646bfda0c6654653.html#a4667ef558c8c3f8a646bfda0c6654653',1,'nlohmann::json_pointer::operator=='],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga265437a0b1f89bf8f23abfc7a4851fe7',1,'cv::operator==()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ef7d0ea1a3ab83c7f256519308a844',1,'cv::cudev::operator==(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c03cd29116a3881ded8063f7b2ba14f',1,'cv::cudev::operator==(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f3a2eceff62c03cd9a882415b1c3f0',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a4d2f075d535c3ff86c0b6bf318e72',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c672631285cf71d4d1d4dbe0efce11f',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4251ba200887d1621e3666dab16287ab',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa06c320c4bd4a2b17768c4139c1a6293',1,'cv::cudev::operator==(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga528b1ebd894984f8761e8b8d88032fa7',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga911a544f2ecd6917b6b4e401bee9d8a5',1,'cv::cudev::operator==(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5dae5116c781ee0064d66d54eb3156d',1,'cv::cudev::operator==(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabc05ae0491425089c125d9df1d4cf71',1,'cv::cudev::operator==(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e265e4d4ec9c9ea2d10b024fa2ad5d5',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3176752b40d5162d7960321c5862a1a',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88f39c819d520a99b1e101b22de693ce',1,'cv::cudev::operator==(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf424cb9b34f4e8037d63be9ac57eacb8',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42690ed246813e13156ee7a94a6edfb8',1,'cv::cudev::operator==(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c2d540d34347146ca6fd7fc13362f18',1,'cv::cudev::operator==(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca47f7f9407e6fd8424aebc82a811283',1,'cv::cudev::operator==(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf63eee75bc9dfcd335ee6100a0ab2b6',1,'cv::cudev::operator==(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d000c2d62a0a2feb023cfce8912b2ef',1,'cv::cudev::operator==(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7b6cc4a40099563d92a21677659e0',1,'cv::cudev::operator==(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10206e51eb5cf79fc73525e83b18b74a',1,'cv::cudev::operator==(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3fb8521b5e67d3ff9ab4a7e1afad12',1,'cv::cudev::operator==(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fc754b6f5b8565f33507efb2275bfb6',1,'cv::cudev::operator==(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be39f600250879de5101123b66504b8',1,'cv::cudev::operator==(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfb79324be9e683545bb7002bc4ab28',1,'cv::cudev::operator==(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ee6639a7f89d8f34c3c6ef3612549c1',1,'cv::cudev::operator==(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4f48f70be081aacfd902bedf1e51fe',1,'cv::cudev::operator==(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c4da213e91b805e976aa524c708c00',1,'cv::cudev::operator==(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56c8ff40e1386ced3569766a16d8d4f',1,'cv::cudev::operator==(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7fd7e441fa19fc3d30891d4a72dd3d',1,'cv::cudev::operator==(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05bbbea75bff44d625777a0f747fa3d8',1,'cv::cudev::operator==(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga792515f0fb51d1d5ec3909796ca83210',1,'cv::cudev::operator==(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b07bce720a1685cb83bf8f41013a25f',1,'cv::cudev::operator==(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18dff9db2290860f6cc90b61deaa1b30',1,'cv::cudev::operator==(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b545fa1278af6ad8c1d637d3177eb10',1,'cv::cudev::operator==(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d099a82124c0e33bdcc5d5e74eaebb2',1,'cv::cudev::operator==(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6783ef41308862477ba5314de3e69d0',1,'cv::cudev::operator==(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4ed94a65ade2bd611d9abb6706e4a2c',1,'cv::cudev::operator==(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac651885fe279e2497a477cbfc1ede96f',1,'cv::cudev::operator==(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2039c53f02ea2409638a50ef3c6be3e',1,'cv::cudev::operator==(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga896fedd904924b35b5d2afcae58f3a0c',1,'cv::cudev::operator==(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cac30ae19e5ed19d98562f0dab48191',1,'cv::cudev::operator==(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeda02a903e1895363cf991717900cd5c',1,'cv::cudev::operator==(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35df58b1d78944360c0d0a1f79eaf903',1,'cv::cudev::operator==(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba49598153961051c9ddf282d36acf2',1,'cv::cudev::operator==(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dd4f1bc3a106a0ae0c8a202dc9b289e',1,'cv::cudev::operator==(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08afcea4414c4e8448351d208645e1d2',1,'cv::cudev::operator==(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa536847ec326ee826054043706320926',1,'cv::cudev::operator==(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1858de8e86a7d74dd5696a3da6622f00',1,'cv::cudev::operator==(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d443a79fa65df214fb74a750765eb33',1,'cv::cudev::operator==(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101069df9b8c98db50d7723eb2452905',1,'cv::cudev::operator==(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f964ff73b6a52ccbeef211ae1202c8',1,'cv::cudev::operator==(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52ca12e909e8009d33d169cc954eb8e6',1,'cv::cudev::operator==(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b6072969257533c8b1c24ae3a35c9a1',1,'cv::cudev::operator==(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59cdc36df6f9053bc413dd3a92522ba3',1,'cv::cudev::operator==(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga666c44211474c9a295525bca03433cee',1,'cv::cudev::operator==(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaea9ab37e1f2dd66c45b3283de613cbd',1,'cv::cudev::operator==(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56b745a12912d7e0b7ae22fd6297902',1,'cv::cudev::operator==(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e9304361fccde39db1ab2ae0c07f68',1,'cv::cudev::operator==(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec3b2bf74cd4ff6af94bb83bdf8783b4',1,'cv::cudev::operator==(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga128ceaedc10a626785f8ce09f554198a',1,'cv::cudev::operator==(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81f8f4793ee7c514eca370438997eb45',1,'cv::cudev::operator==(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1329e50637b7b5ac07100d3e263331d',1,'cv::cudev::operator==(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78683b47cb3562be1f4d48606497e409',1,'cv::cudev::operator==(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa32ae379c00e669b968b3090cd815e2a',1,'cv::cudev::operator==(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29a49819fa81a12fdb40418ecfed5085',1,'cv::cudev::operator==(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f3770d45d2f2184aefca17515d82fc8',1,'cv::cudev::operator==(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36065bc2f0c37455244db7f412296a59',1,'cv::cudev::operator==(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1c6ff78a4c2957eb469cce1e0d9892b',1,'cv::cudev::operator==(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24b60bc88c8796c3b7d230868e9d1e65',1,'cv::cudev::operator==(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0cf450da39a02ef534f92365e71eef9',1,'cv::cudev::operator==(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d7fcd75c972fae50f91d56bd0f815a',1,'cv::cudev::operator==(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dcbfffb2623cdd808a82387de219fdb',1,'cv::cudev::operator==(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76e79f2930fab6ae0c14b89445494a83',1,'cv::cudev::operator==(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3cb39b62df9f3c283aa768412fda24bc',1,'cv::cudev::operator==(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4940b8cdca244cec798fc5e12b96ed8e',1,'cv::cudev::operator==(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c906fac8d8e04f4c1b62ba525fd1617',1,'cv::cudev::operator==(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12c2c61f6d87749a497db6cb678835db',1,'cv::cudev::operator==(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd318fb104522620d4d12b98b93c8974',1,'cv::cudev::operator==(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff38bcfdc1dca4e5abfac0ca3b117fc',1,'cv::cudev::operator==(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ba83f60df077bb1b5654a2ee1afb367',1,'cv::cudev::operator==(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ec516b24d0b6b66b6419089b9bc0713',1,'cv::cudev::operator==(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c31130c36dc9b842e26fdaf680e00b6',1,'cv::cudev::operator==(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b31d6c71170412cae5061aa6ac19442',1,'cv::cudev::operator==(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecc2ba37fea0d1d795a2cab8ece45cc1',1,'cv::cudev::operator==(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e7ea06c654354b984128255037d55fd',1,'cv::cudev::operator==(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf30eab4cac32df44e33444bfe7b0070',1,'cv::cudev::operator==(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb69979b7b37bfd566ca1ab2da349c98',1,'cv::cudev::operator==(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7697781422bbb9de18a582f93388324c',1,'cv::cudev::operator==(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46152b0d4aabffb4ca701da3b541068b',1,'cv::cudev::operator==(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6fbc5b8438fe5bea85238b9d0c5f3e',1,'cv::cudev::operator==(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade08fcc308b2e20d50c4a3438fe4b6ee',1,'cv::cudev::operator==(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae34b2a72fe4150e858465a7769ee2c52',1,'cv::cudev::operator==(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0c0ceb6055acb375303cecd49634749',1,'cv::cudev::operator==(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3eff50212ed2892cd6fe4b8d19dd3a2a',1,'cv::cudev::operator==(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga853c4c648ea2ed3ba048ed254fa6f394',1,'cv::cudev::operator==(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96ad2da041f97e4dc0ea14e0da62fe96',1,'cv::cudev::operator==(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5346316989e032dda02d05565286aba1',1,'cv::cudev::operator==(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80fad755179790ebd605e94301d180ef',1,'cv::cudev::operator==(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3123a45c875b4eb9a41975aa969b6db5',1,'cv::cudev::operator==(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63e43865abdcf4a38d39a5eb89729f63',1,'cv::cudev::operator==(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5a0f9e14535efa9de7e727cef2f9bcd',1,'cv::cudev::operator==(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa49d3faa449c6996a36b4cfe9bc746e7',1,'cv::cudev::operator==(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89677a515b08e742fc50a35d1798fc03',1,'cv::cudev::operator==(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9447ed9200cf81281050367c324bdf10',1,'cv::cudev::operator==(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabee6ab2431bb58230e98a0ede9c6d337',1,'cv::cudev::operator==(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42afbc516bbfa01e1310a9bab908702',1,'cv::cudev::operator==(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0a74127fa51af116df67364acd93bd3',1,'cv::cudev::operator==(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e730bd659adc74654d92449dad36b9d',1,'cv::cudev::operator==(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga346d65131b0e3c9e3ac61de5176606a8',1,'cv::cudev::operator==(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa30c0df3a7b04d70749c2ab8b6fff5fe',1,'cv::cudev::operator==(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec539fea1d620f685a11e9d391f78afd',1,'cv::cudev::operator==(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b435363def80bdc86a9841a802a2ca',1,'cv::cudev::operator==(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1153ecbaadb6527bf4913cc87d984850',1,'cv::cudev::operator==(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9127ac6fce50f851f7d47463fa632fbf',1,'cv::cudev::operator==(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga612438c13d01ed44d78967a7febf0eb0',1,'cv::cudev::operator==(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00a17f5eee9ac60ccb1ababf1fd1e73b',1,'cv::cudev::operator==(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd8701578ccdf15bc6cbb4d3d5517c9',1,'cv::cudev::operator==(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2bb15eb31a7a24d0434a3a131d06d8',1,'cv::cudev::operator==(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/d0/d1a/namespacecv_1_1gapi_1_1fluid.html#a10b8ba4730d3e056eb20a3ec7b1cee96',1,'cv::gapi::fluid::operator==()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#adc6dd73da3e9d530ba62bb4de813ce59',1,'cv::gapi::own::operator==(const Scalar &lhs, const Scalar &rhs)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a67f8ec451661ed549feca91a814d84e9',1,'cv::gapi::own::operator==(const Rect &lhs, const Rect &rhs)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#aa2f43bcd90b89230eadc4556a534cf0d',1,'cv::gapi::own::operator==(const Size &lhs, const Size &rhs)'],['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a3025fa7e3d6892a5ee2144bf3b564c22',1,'cv::instr::operator==()'],['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#ad1e6cef1a8e7e7dbed38321d38691c9d',1,'cv::tbm::operator==()'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a4d75335a7cc12c0d62a854c9151e02d2',1,'cv::util::operator==(const util::monostate &, const util::monostate &)'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a671a36e09de46881212b09f980d86b00',1,'cv::util::operator==(const variant< Us... > &lhs, const variant< Us... > &rhs)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf9ae987f5788edbe1aada59dd7f41717',1,'operator==(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga972dee821ab26d61f11528b427131083',1,'operator==(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga265437a0b1f89bf8f23abfc7a4851fe7',1,'operator==(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ef7d0ea1a3ab83c7f256519308a844',1,'operator==(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c03cd29116a3881ded8063f7b2ba14f',1,'operator==(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f3a2eceff62c03cd9a882415b1c3f0',1,'operator==(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a4d2f075d535c3ff86c0b6bf318e72',1,'operator==(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c672631285cf71d4d1d4dbe0efce11f',1,'operator==(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4251ba200887d1621e3666dab16287ab',1,'operator==(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa06c320c4bd4a2b17768c4139c1a6293',1,'operator==(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga528b1ebd894984f8761e8b8d88032fa7',1,'operator==(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga911a544f2ecd6917b6b4e401bee9d8a5',1,'operator==(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5dae5116c781ee0064d66d54eb3156d',1,'operator==(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabc05ae0491425089c125d9df1d4cf71',1,'operator==(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e265e4d4ec9c9ea2d10b024fa2ad5d5',1,'operator==(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3176752b40d5162d7960321c5862a1a',1,'operator==(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88f39c819d520a99b1e101b22de693ce',1,'operator==(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf424cb9b34f4e8037d63be9ac57eacb8',1,'operator==(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42690ed246813e13156ee7a94a6edfb8',1,'operator==(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c2d540d34347146ca6fd7fc13362f18',1,'operator==(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca47f7f9407e6fd8424aebc82a811283',1,'operator==(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf63eee75bc9dfcd335ee6100a0ab2b6',1,'operator==(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d000c2d62a0a2feb023cfce8912b2ef',1,'operator==(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7b6cc4a40099563d92a21677659e0',1,'operator==(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10206e51eb5cf79fc73525e83b18b74a',1,'operator==(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3fb8521b5e67d3ff9ab4a7e1afad12',1,'operator==(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fc754b6f5b8565f33507efb2275bfb6',1,'operator==(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be39f600250879de5101123b66504b8',1,'operator==(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfb79324be9e683545bb7002bc4ab28',1,'operator==(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ee6639a7f89d8f34c3c6ef3612549c1',1,'operator==(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4f48f70be081aacfd902bedf1e51fe',1,'operator==(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c4da213e91b805e976aa524c708c00',1,'operator==(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56c8ff40e1386ced3569766a16d8d4f',1,'operator==(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7fd7e441fa19fc3d30891d4a72dd3d',1,'operator==(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05bbbea75bff44d625777a0f747fa3d8',1,'operator==(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga792515f0fb51d1d5ec3909796ca83210',1,'operator==(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b07bce720a1685cb83bf8f41013a25f',1,'operator==(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18dff9db2290860f6cc90b61deaa1b30',1,'operator==(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b545fa1278af6ad8c1d637d3177eb10',1,'operator==(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d099a82124c0e33bdcc5d5e74eaebb2',1,'operator==(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6783ef41308862477ba5314de3e69d0',1,'operator==(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4ed94a65ade2bd611d9abb6706e4a2c',1,'operator==(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac651885fe279e2497a477cbfc1ede96f',1,'operator==(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2039c53f02ea2409638a50ef3c6be3e',1,'operator==(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga896fedd904924b35b5d2afcae58f3a0c',1,'operator==(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cac30ae19e5ed19d98562f0dab48191',1,'operator==(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeda02a903e1895363cf991717900cd5c',1,'operator==(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35df58b1d78944360c0d0a1f79eaf903',1,'operator==(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba49598153961051c9ddf282d36acf2',1,'operator==(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dd4f1bc3a106a0ae0c8a202dc9b289e',1,'operator==(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08afcea4414c4e8448351d208645e1d2',1,'operator==(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa536847ec326ee826054043706320926',1,'operator==(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1858de8e86a7d74dd5696a3da6622f00',1,'operator==(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d443a79fa65df214fb74a750765eb33',1,'operator==(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101069df9b8c98db50d7723eb2452905',1,'operator==(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f964ff73b6a52ccbeef211ae1202c8',1,'operator==(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52ca12e909e8009d33d169cc954eb8e6',1,'operator==(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b6072969257533c8b1c24ae3a35c9a1',1,'operator==(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59cdc36df6f9053bc413dd3a92522ba3',1,'operator==(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga666c44211474c9a295525bca03433cee',1,'operator==(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaea9ab37e1f2dd66c45b3283de613cbd',1,'operator==(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56b745a12912d7e0b7ae22fd6297902',1,'operator==(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e9304361fccde39db1ab2ae0c07f68',1,'operator==(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec3b2bf74cd4ff6af94bb83bdf8783b4',1,'operator==(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga128ceaedc10a626785f8ce09f554198a',1,'operator==(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81f8f4793ee7c514eca370438997eb45',1,'operator==(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1329e50637b7b5ac07100d3e263331d',1,'operator==(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78683b47cb3562be1f4d48606497e409',1,'operator==(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa32ae379c00e669b968b3090cd815e2a',1,'operator==(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29a49819fa81a12fdb40418ecfed5085',1,'operator==(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f3770d45d2f2184aefca17515d82fc8',1,'operator==(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36065bc2f0c37455244db7f412296a59',1,'operator==(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1c6ff78a4c2957eb469cce1e0d9892b',1,'operator==(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24b60bc88c8796c3b7d230868e9d1e65',1,'operator==(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0cf450da39a02ef534f92365e71eef9',1,'operator==(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d7fcd75c972fae50f91d56bd0f815a',1,'operator==(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dcbfffb2623cdd808a82387de219fdb',1,'operator==(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76e79f2930fab6ae0c14b89445494a83',1,'operator==(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3cb39b62df9f3c283aa768412fda24bc',1,'operator==(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4940b8cdca244cec798fc5e12b96ed8e',1,'operator==(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c906fac8d8e04f4c1b62ba525fd1617',1,'operator==(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12c2c61f6d87749a497db6cb678835db',1,'operator==(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd318fb104522620d4d12b98b93c8974',1,'operator==(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff38bcfdc1dca4e5abfac0ca3b117fc',1,'operator==(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ba83f60df077bb1b5654a2ee1afb367',1,'operator==(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ec516b24d0b6b66b6419089b9bc0713',1,'operator==(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c31130c36dc9b842e26fdaf680e00b6',1,'operator==(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b31d6c71170412cae5061aa6ac19442',1,'operator==(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecc2ba37fea0d1d795a2cab8ece45cc1',1,'operator==(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e7ea06c654354b984128255037d55fd',1,'operator==(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf30eab4cac32df44e33444bfe7b0070',1,'operator==(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb69979b7b37bfd566ca1ab2da349c98',1,'operator==(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7697781422bbb9de18a582f93388324c',1,'operator==(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46152b0d4aabffb4ca701da3b541068b',1,'operator==(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6fbc5b8438fe5bea85238b9d0c5f3e',1,'operator==(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade08fcc308b2e20d50c4a3438fe4b6ee',1,'operator==(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae34b2a72fe4150e858465a7769ee2c52',1,'operator==(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0c0ceb6055acb375303cecd49634749',1,'operator==(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3eff50212ed2892cd6fe4b8d19dd3a2a',1,'operator==(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga853c4c648ea2ed3ba048ed254fa6f394',1,'operator==(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96ad2da041f97e4dc0ea14e0da62fe96',1,'operator==(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5346316989e032dda02d05565286aba1',1,'operator==(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80fad755179790ebd605e94301d180ef',1,'operator==(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3123a45c875b4eb9a41975aa969b6db5',1,'operator==(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63e43865abdcf4a38d39a5eb89729f63',1,'operator==(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5a0f9e14535efa9de7e727cef2f9bcd',1,'operator==(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa49d3faa449c6996a36b4cfe9bc746e7',1,'operator==(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89677a515b08e742fc50a35d1798fc03',1,'operator==(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9447ed9200cf81281050367c324bdf10',1,'operator==(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabee6ab2431bb58230e98a0ede9c6d337',1,'operator==(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42afbc516bbfa01e1310a9bab908702',1,'operator==(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0a74127fa51af116df67364acd93bd3',1,'operator==(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e730bd659adc74654d92449dad36b9d',1,'operator==(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga346d65131b0e3c9e3ac61de5176606a8',1,'operator==(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa30c0df3a7b04d70749c2ab8b6fff5fe',1,'operator==(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec539fea1d620f685a11e9d391f78afd',1,'operator==(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b435363def80bdc86a9841a802a2ca',1,'operator==(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1153ecbaadb6527bf4913cc87d984850',1,'operator==(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9127ac6fce50f851f7d47463fa632fbf',1,'operator==(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga612438c13d01ed44d78967a7febf0eb0',1,'operator==(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00a17f5eee9ac60ccb1ababf1fd1e73b',1,'operator==(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd8701578ccdf15bc6cbb4d3d5517c9',1,'operator==(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2bb15eb31a7a24d0434a3a131d06d8',1,'operator==(double s, const double1 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ae7f71d536da5bf14e2d75305b4b88da5',1,'__gnu_cxx::operator==(const _Pointer_adapter< _Tp > &__lhs, const _Pointer_adapter< _Tp > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#acbaf9ba3f0e9c26a8239a313ad714fa8',1,'__gnu_cxx::operator==(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ad0ff7d116cd8134193d3d843552d750c',1,'__gnu_cxx::operator==(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a20ca06133e85c3a0ea49857488a5b94c',1,'__gnu_cxx::operator==(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga0431ac39f84ec7f88d6bdb9db72bd5b9',1,'std::operator==(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a50d898f211d37c5a47907f462b0b17f1',1,'std::operator==(const fpos< _StateT > &__lhs, const fpos< _StateT > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a05fbef1e7e15558f5933ed15a339e97d',1,'std::operator==(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#gaadf1270d8fcc1bdae9a699e3d85c7986',1,'std::operator==(const reverse_iterator< _Iterator > &__x, const reverse_iterator< _Iterator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7aeb223367d887a2b7f358a50e15e6f2',1,'std::operator==(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga5559f33b5ba6dbf83e961888d324dd40',1,'std::operator==(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad2629e7ee31ca36d6d593639e698db6b',1,'std::operator==(const function< _Res(_Args...)> &__f, nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a225870d9721816ebaa535af4e19d0cc1',1,'std::operator==(nullptr_t, const function< _Res(_Args...)> &__f) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ada60c841e9fe08814304ae79d35267de',1,'std::operator==(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aeed20ec23d92debc5bd1a0c0ee6c1b52',1,'std::operator==(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga89f3784efc6a944b4857408f1fcf7f3b',1,'std::operator==(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga811c7e6a67b83ef003e899c4ea93b910',1,'std::operator==(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d6c242794f6d1866eb9cc58678ce8b1',1,'std::operator==(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae583f778cadadef72db1f8afaa7bc4a1',1,'std::operator==(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga472d58de0896c76b3d402dbf27aa75c8',1,'std::operator==(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae4390d0b1712ee5334c61da6e0576d08',1,'std::operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga51b1c9a2beb5254d11c13dbc22a8e379',1,'std::operator==(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ada41d3682184f0d0d8525907fdfcbea8',1,'std::operator==(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2cc59dba70d0427b9e006411b37aee81',1,'std::operator==(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaac6078c1098e92d740d6d226f1c5e3dd',1,'std::operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa823b88deb57ba1b2494ea0dbcc028a8',1,'std::operator==(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa2053d06d62313a4cde70f0f1d1f04c0',1,'std::operator==(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafcc9a7386753edf6a626ce090f9d4cd3',1,'std::operator==(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a60c2de42339c226dbeaeb60ef54b7bd2',1,'std::operator==(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a648834d2b253af7787093fe9156662f5',1,'std::operator==(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aecebb49b7915414fe7fd3eaff7c8516c',1,'std::operator==(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4edac9ce553e84f7c97c02172d93424e',1,'std::operator==(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaca932655bd64e8b079c145921e0d1d62',1,'std::operator==(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5bbecf180e08f24cdb60411af07873be',1,'std::operator==(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga8ce82b2067ebaf21931151dfee549f0d',1,'std::operator==(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaca932655bd64e8b079c145921e0d1d62',1,'operator==(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5bbecf180e08f24cdb60411af07873be',1,'operator==(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga8ce82b2067ebaf21931151dfee549f0d',1,'operator==(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga0431ac39f84ec7f88d6bdb9db72bd5b9',1,'operator==(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#gaadf1270d8fcc1bdae9a699e3d85c7986',1,'operator==(const reverse_iterator< _Iterator > &__x, const reverse_iterator< _Iterator > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga89f3784efc6a944b4857408f1fcf7f3b',1,'operator==(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga811c7e6a67b83ef003e899c4ea93b910',1,'operator==(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae583f778cadadef72db1f8afaa7bc4a1',1,'operator==(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga472d58de0896c76b3d402dbf27aa75c8',1,'operator==(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae4390d0b1712ee5334c61da6e0576d08',1,'operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga51b1c9a2beb5254d11c13dbc22a8e379',1,'operator==(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaac6078c1098e92d740d6d226f1c5e3dd',1,'operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafcc9a7386753edf6a626ce090f9d4cd3',1,'operator==(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga5559f33b5ba6dbf83e961888d324dd40',1,'operator==(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], - ['operator_3e_342',['operator>',['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html#a02573cd46ba9f4cf2fa8e7b40cde41df',1,'cv::detail::GraphEdge::operator>()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a85401ad9773e0afda99ae87137f26b6d',1,'cv::MatExpr::operator>(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae14822d723b02a44dcc6b9dc66b9d2d6',1,'cv::MatExpr::operator>(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#affc3d68c3891df1237e9a9bd96856c8c',1,'cv::MatExpr::operator>(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a35767a6160d961e75fbc3613e1b9f0a5',1,'cv::MatExpr::operator>(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a28ec289f14a0c25c6e9d1a596318ede3',1,'cv::MatExpr::operator>(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a85401ad9773e0afda99ae87137f26b6d',1,'cv::MatExpr::operator>(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae14822d723b02a44dcc6b9dc66b9d2d6',1,'cv::MatExpr::operator>(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#affc3d68c3891df1237e9a9bd96856c8c',1,'cv::MatExpr::operator>(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a35767a6160d961e75fbc3613e1b9f0a5',1,'cv::MatExpr::operator>(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a28ec289f14a0c25c6e9d1a596318ede3',1,'cv::MatExpr::operator>(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga89a6048ae27277f5f84458078a447a7b',1,'cv::softdouble::operator>()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9e6bd3f5911bf05d858b143d76813b13',1,'cv::softfloat::operator>()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a87db51b6b936fb2ea293cdbc8702dcb8.html#a87db51b6b936fb2ea293cdbc8702dcb8',1,'nlohmann::basic_json::operator>'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9ea8e0e86820fcb3ab0fc937d41226e7.html#a9ea8e0e86820fcb3ab0fc937d41226e7',1,'nlohmann::basic_json::operator>'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a67771044f08fd07105b34667615d9e0e.html#a67771044f08fd07105b34667615d9e0e',1,'nlohmann::basic_json::operator>'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga53b1ef03655e02eabf49238a5927f384',1,'cv::operator>()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf76a5cbe9661c03341fed10338283b3a',1,'cv::cudev::operator>(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35b979bc99aa0c19b8b03d0191c0aef',1,'cv::cudev::operator>(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fe6218c267adf7bf750b607bcee1dde',1,'cv::cudev::operator>(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557a3a12df84d433097b5f1df0d7d04',1,'cv::cudev::operator>(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga192ad383159b69ca2292f072b38508f9',1,'cv::cudev::operator>(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd71f8794eb458670da81e6e31ebd40d',1,'cv::cudev::operator>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga805cfea7bfd59489c103d6ea068e5dd8',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga876bfb5116ae02ad4707fb201477a535',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58c9c31838a279487423f7f3582c4913',1,'cv::cudev::operator>(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c5037a273d23375d3020863519e7732',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81c1cf50caa6fdfec4decace6bfacbff',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9020160028347e36054f9780e546ad2',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09090c1f87b4fcc6c50a59befc7b7d1',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5762932e36ee52fdf93dc9af9a9ae5f',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga631a8e54c62472f3efd66b05c220ac99',1,'cv::cudev::operator>(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ca5edb7aebb689a224b13a06da7c096',1,'cv::cudev::operator>(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92f4356bcda49befcae07fe5897806ef',1,'cv::cudev::operator>(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga462d276943a4befba6bd1e5f7597ab43',1,'cv::cudev::operator>(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab987b25924d83dcbbb586e8c82b54457',1,'cv::cudev::operator>(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab42431af22ff2b15ff34bc2ca158d648',1,'cv::cudev::operator>(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ecf652b96c5cf329f62e04e798c7938',1,'cv::cudev::operator>(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6181bf9f0fc217c2fa0062df7dd997',1,'cv::cudev::operator>(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78139b6caee2bfff7f7e416fd4c0fa86',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33f4d71b881eec12c81fa08710e13b90',1,'cv::cudev::operator>(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa24e4c795c4f9dff281f74e4a49517',1,'cv::cudev::operator>(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga979bbc65c1aa9cb961473faeec0c001d',1,'cv::cudev::operator>(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga763bba01a3388aa4241f24b934a36b9e',1,'cv::cudev::operator>(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a322f89d75c39df09b42d571cde02c',1,'cv::cudev::operator>(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadea03e1ebb6998d08fe7e356fc675da4',1,'cv::cudev::operator>(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfd53947e82410ed70ef8af8e469be95',1,'cv::cudev::operator>(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00fc760015647c4518fc1c250b34f3a0',1,'cv::cudev::operator>(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aac1815665d44067eae7d8cb4e4be40',1,'cv::cudev::operator>(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53328b4712dbd36f5bc5fc303973997c',1,'cv::cudev::operator>(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fcd4b8ca094ed23e6c523f312c075b8',1,'cv::cudev::operator>(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e9ae77beea1adff95bca10ef7401942',1,'cv::cudev::operator>(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga208a8ecd6574e328b8b89dce3d96550a',1,'cv::cudev::operator>(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeba9c5a1af22468fa4de9e27a7291c17',1,'cv::cudev::operator>(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60ce8fe5baf2a39a1963c206fe8f2283',1,'cv::cudev::operator>(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3605088dd4d00bc3d812c01485e0c854',1,'cv::cudev::operator>(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae77b149d4b2eda29c2d2e09c7a265f1',1,'cv::cudev::operator>(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9707f1f0bd1f08a43c8c6faaf389ef',1,'cv::cudev::operator>(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa790adfb4f6f2fa460c244f2f7621ed3',1,'cv::cudev::operator>(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeed166390fcd3b6634764bad3f4dfe99',1,'cv::cudev::operator>(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd896dcb0ea5b24ddf9a17b006ed2701',1,'cv::cudev::operator>(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae003f99da4c8129f3ce6908560dd6598',1,'cv::cudev::operator>(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac94d95ec080ec57be5729ff0a14d6740',1,'cv::cudev::operator>(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3292736e722c948bfee81f8ce13d285',1,'cv::cudev::operator>(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eadb9c719cbffb8161d58910fc8bf13',1,'cv::cudev::operator>(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5aa17050b6e23908154a490b186e5592',1,'cv::cudev::operator>(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad280748a5ba0aaef06f5f48f8d162fd0',1,'cv::cudev::operator>(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga122cfa74c83428505a928ea12d304942',1,'cv::cudev::operator>(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a4586e4cf8cd4353f49b0ac4d474553',1,'cv::cudev::operator>(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39b292f62396880cbe964128a125a2a8',1,'cv::cudev::operator>(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557ed1e9462d24223497a0c53db7d90',1,'cv::cudev::operator>(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b85167fb47e745fce108d23ae3674e0',1,'cv::cudev::operator>(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef695f029df417b63799eff1f8e20218',1,'cv::cudev::operator>(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdda92bd64d36ec1d43b5ce270677166',1,'cv::cudev::operator>(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff20e4d2dbcb670af32bba301c579fbc',1,'cv::cudev::operator>(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ec6a668ce4bdaee3fb96cd6af71bd59',1,'cv::cudev::operator>(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1eba4d1da0623f9c69a57db9e769144',1,'cv::cudev::operator>(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ed513d4cb9e4110d3db70f50be835ba',1,'cv::cudev::operator>(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fbdf61b01310dfb036bb6ffef461b8a',1,'cv::cudev::operator>(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab1a02c460ac72367d4652923fba630b',1,'cv::cudev::operator>(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga293527eeddad289a3efad53f1a4b6f3f',1,'cv::cudev::operator>(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadc84b344cba3e9d8279cce4daa335a3',1,'cv::cudev::operator>(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae6976ca05a71a3867491b1d63a38d79',1,'cv::cudev::operator>(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4d496fb1ee18b3cd918b6a3092c629',1,'cv::cudev::operator>(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9683b0f490d61333a0c9b0ac6177c797',1,'cv::cudev::operator>(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf173de4fa9a66e44f6e01e46e50fb96e',1,'cv::cudev::operator>(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6961930505501ab67e70de1bec1fc7c',1,'cv::cudev::operator>(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3be2422dd410d768a47a1523612c6e2',1,'cv::cudev::operator>(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga231392fd7250c8b1cba1027db6dd2f59',1,'cv::cudev::operator>(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7365378eede3da961a558ff603f0a8f2',1,'cv::cudev::operator>(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a4ad2ef4e95c53079cda25bcb76fc53',1,'cv::cudev::operator>(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga337362bc409dec3c7470826563fd08d5',1,'cv::cudev::operator>(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a78dc7183016b7eaa8994891ac7349e',1,'cv::cudev::operator>(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb89d12f168130b16b6a852fbcf29ac1',1,'cv::cudev::operator>(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd0188a961cefcfb26b7b15fac712e82',1,'cv::cudev::operator>(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13fc85d9e1c15b1d1d2c862936ab29cf',1,'cv::cudev::operator>(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6d6be81f2d1ad7424d414f6028a6dfd',1,'cv::cudev::operator>(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c3a579dea9a2c50a6082bf7c5c50d1f',1,'cv::cudev::operator>(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c88870704b2df7f664851aed891ab38',1,'cv::cudev::operator>(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabfe335f05bb7a355f8e2cf6d4ad83c3',1,'cv::cudev::operator>(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444c5e1f7f62cf798066d5659366df23',1,'cv::cudev::operator>(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab561641feed35c20278ece35bb8797b3',1,'cv::cudev::operator>(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b861ce2de51abdd03593b3d3d84f684',1,'cv::cudev::operator>(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c1fd7fbe4e5985f1d2fa725731eb08',1,'cv::cudev::operator>(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9e6afe8941f12362335b1a80e42496',1,'cv::cudev::operator>(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9896d8eed5804f7d4900f8b8266295ba',1,'cv::cudev::operator>(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca64d102ed2cfae7f3abeb781421204',1,'cv::cudev::operator>(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac833608b2481b20d0d91a71036d45d',1,'cv::cudev::operator>(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2237c47c62d003ee6a19ff2b3cd54b2',1,'cv::cudev::operator>(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990332db3565090a646987254c79fab4',1,'cv::cudev::operator>(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4e587facdf3b1a86a40be230639efef',1,'cv::cudev::operator>(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67f6d1cb7b1b325a6dfe5414dbb94dbd',1,'cv::cudev::operator>(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98a98af64c25c869aae0f4ad0c55af4',1,'cv::cudev::operator>(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fd6dc47e174621164179fbf737f2809',1,'cv::cudev::operator>(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd34ffd2648022fee481fe264945565c',1,'cv::cudev::operator>(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c9c2d7a26f8d9c7b8834f9f190a8914',1,'cv::cudev::operator>(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga640d6afcfb462ced93eefa1b697cd060',1,'cv::cudev::operator>(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa37cb32841f9ffa14b1936e05a1ebe9',1,'cv::cudev::operator>(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e97195a2b7cecf5ede8e47d260723c',1,'cv::cudev::operator>(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga335811f06efddba5e75ce0116d04783a',1,'cv::cudev::operator>(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa4f074c9ea9489fd8b41157998c5fed',1,'cv::cudev::operator>(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f1e7ce1a6510265ead6b6207f39effc',1,'cv::cudev::operator>(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9756cee47606a4de0ca1c3c8e97a40b2',1,'cv::cudev::operator>(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d783278f798a238eb375b58e4eeade4',1,'cv::cudev::operator>(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab439a8c37814ba930d4f4f0d15095883',1,'cv::cudev::operator>(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad508ec58830cc1077eb07e8fc153fd',1,'cv::cudev::operator>(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga408471782e6c3338d5ee9de16e31644e',1,'cv::cudev::operator>(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35415f4fd50ebd8a203fef079c54ec8d',1,'cv::cudev::operator>(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14fe180ed1d9c9666c46e88a36c421a8',1,'cv::cudev::operator>(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab45d33bf92b38f1331208282fda45064',1,'cv::cudev::operator>(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c384571fec644fe63911fd26bf6e6b',1,'cv::cudev::operator>(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31473d08b4bb642729365caf9a6c0e39',1,'cv::cudev::operator>(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa100c0ecc7e8aec9341b40562ac55b3a',1,'cv::cudev::operator>(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb98ebc2ade19b8e960fa40f5d6a253e',1,'cv::cudev::operator>(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eaa0d1ca6c4bb54774350171b9e16b5',1,'cv::cudev::operator>(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6458afcdc07e562050e4315122f859d2',1,'cv::cudev::operator>(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d2cc8c1b0507e85f915853485ecc6d0',1,'cv::cudev::operator>(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9e6bd3f5911bf05d858b143d76813b13',1,'operator>(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga89a6048ae27277f5f84458078a447a7b',1,'operator>(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga53b1ef03655e02eabf49238a5927f384',1,'operator>(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf76a5cbe9661c03341fed10338283b3a',1,'operator>(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35b979bc99aa0c19b8b03d0191c0aef',1,'operator>(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fe6218c267adf7bf750b607bcee1dde',1,'operator>(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557a3a12df84d433097b5f1df0d7d04',1,'operator>(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga192ad383159b69ca2292f072b38508f9',1,'operator>(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd71f8794eb458670da81e6e31ebd40d',1,'operator>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga805cfea7bfd59489c103d6ea068e5dd8',1,'operator>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga876bfb5116ae02ad4707fb201477a535',1,'operator>(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58c9c31838a279487423f7f3582c4913',1,'operator>(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c5037a273d23375d3020863519e7732',1,'operator>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81c1cf50caa6fdfec4decace6bfacbff',1,'operator>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9020160028347e36054f9780e546ad2',1,'operator>(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09090c1f87b4fcc6c50a59befc7b7d1',1,'operator>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5762932e36ee52fdf93dc9af9a9ae5f',1,'operator>(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga631a8e54c62472f3efd66b05c220ac99',1,'operator>(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ca5edb7aebb689a224b13a06da7c096',1,'operator>(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92f4356bcda49befcae07fe5897806ef',1,'operator>(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga462d276943a4befba6bd1e5f7597ab43',1,'operator>(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab987b25924d83dcbbb586e8c82b54457',1,'operator>(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab42431af22ff2b15ff34bc2ca158d648',1,'operator>(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ecf652b96c5cf329f62e04e798c7938',1,'operator>(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6181bf9f0fc217c2fa0062df7dd997',1,'operator>(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78139b6caee2bfff7f7e416fd4c0fa86',1,'operator>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33f4d71b881eec12c81fa08710e13b90',1,'operator>(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa24e4c795c4f9dff281f74e4a49517',1,'operator>(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga979bbc65c1aa9cb961473faeec0c001d',1,'operator>(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga763bba01a3388aa4241f24b934a36b9e',1,'operator>(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a322f89d75c39df09b42d571cde02c',1,'operator>(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadea03e1ebb6998d08fe7e356fc675da4',1,'operator>(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfd53947e82410ed70ef8af8e469be95',1,'operator>(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00fc760015647c4518fc1c250b34f3a0',1,'operator>(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aac1815665d44067eae7d8cb4e4be40',1,'operator>(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53328b4712dbd36f5bc5fc303973997c',1,'operator>(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fcd4b8ca094ed23e6c523f312c075b8',1,'operator>(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e9ae77beea1adff95bca10ef7401942',1,'operator>(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga208a8ecd6574e328b8b89dce3d96550a',1,'operator>(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeba9c5a1af22468fa4de9e27a7291c17',1,'operator>(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60ce8fe5baf2a39a1963c206fe8f2283',1,'operator>(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3605088dd4d00bc3d812c01485e0c854',1,'operator>(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae77b149d4b2eda29c2d2e09c7a265f1',1,'operator>(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9707f1f0bd1f08a43c8c6faaf389ef',1,'operator>(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa790adfb4f6f2fa460c244f2f7621ed3',1,'operator>(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeed166390fcd3b6634764bad3f4dfe99',1,'operator>(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd896dcb0ea5b24ddf9a17b006ed2701',1,'operator>(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae003f99da4c8129f3ce6908560dd6598',1,'operator>(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac94d95ec080ec57be5729ff0a14d6740',1,'operator>(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3292736e722c948bfee81f8ce13d285',1,'operator>(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eadb9c719cbffb8161d58910fc8bf13',1,'operator>(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5aa17050b6e23908154a490b186e5592',1,'operator>(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad280748a5ba0aaef06f5f48f8d162fd0',1,'operator>(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga122cfa74c83428505a928ea12d304942',1,'operator>(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a4586e4cf8cd4353f49b0ac4d474553',1,'operator>(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39b292f62396880cbe964128a125a2a8',1,'operator>(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557ed1e9462d24223497a0c53db7d90',1,'operator>(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b85167fb47e745fce108d23ae3674e0',1,'operator>(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef695f029df417b63799eff1f8e20218',1,'operator>(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdda92bd64d36ec1d43b5ce270677166',1,'operator>(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff20e4d2dbcb670af32bba301c579fbc',1,'operator>(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ec6a668ce4bdaee3fb96cd6af71bd59',1,'operator>(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1eba4d1da0623f9c69a57db9e769144',1,'operator>(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ed513d4cb9e4110d3db70f50be835ba',1,'operator>(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fbdf61b01310dfb036bb6ffef461b8a',1,'operator>(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab1a02c460ac72367d4652923fba630b',1,'operator>(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga293527eeddad289a3efad53f1a4b6f3f',1,'operator>(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadc84b344cba3e9d8279cce4daa335a3',1,'operator>(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae6976ca05a71a3867491b1d63a38d79',1,'operator>(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4d496fb1ee18b3cd918b6a3092c629',1,'operator>(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9683b0f490d61333a0c9b0ac6177c797',1,'operator>(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf173de4fa9a66e44f6e01e46e50fb96e',1,'operator>(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6961930505501ab67e70de1bec1fc7c',1,'operator>(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3be2422dd410d768a47a1523612c6e2',1,'operator>(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga231392fd7250c8b1cba1027db6dd2f59',1,'operator>(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7365378eede3da961a558ff603f0a8f2',1,'operator>(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a4ad2ef4e95c53079cda25bcb76fc53',1,'operator>(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga337362bc409dec3c7470826563fd08d5',1,'operator>(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a78dc7183016b7eaa8994891ac7349e',1,'operator>(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb89d12f168130b16b6a852fbcf29ac1',1,'operator>(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd0188a961cefcfb26b7b15fac712e82',1,'operator>(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13fc85d9e1c15b1d1d2c862936ab29cf',1,'operator>(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6d6be81f2d1ad7424d414f6028a6dfd',1,'operator>(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c3a579dea9a2c50a6082bf7c5c50d1f',1,'operator>(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c88870704b2df7f664851aed891ab38',1,'operator>(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabfe335f05bb7a355f8e2cf6d4ad83c3',1,'operator>(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444c5e1f7f62cf798066d5659366df23',1,'operator>(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab561641feed35c20278ece35bb8797b3',1,'operator>(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b861ce2de51abdd03593b3d3d84f684',1,'operator>(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c1fd7fbe4e5985f1d2fa725731eb08',1,'operator>(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9e6afe8941f12362335b1a80e42496',1,'operator>(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9896d8eed5804f7d4900f8b8266295ba',1,'operator>(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca64d102ed2cfae7f3abeb781421204',1,'operator>(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac833608b2481b20d0d91a71036d45d',1,'operator>(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2237c47c62d003ee6a19ff2b3cd54b2',1,'operator>(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990332db3565090a646987254c79fab4',1,'operator>(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4e587facdf3b1a86a40be230639efef',1,'operator>(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67f6d1cb7b1b325a6dfe5414dbb94dbd',1,'operator>(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98a98af64c25c869aae0f4ad0c55af4',1,'operator>(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fd6dc47e174621164179fbf737f2809',1,'operator>(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd34ffd2648022fee481fe264945565c',1,'operator>(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c9c2d7a26f8d9c7b8834f9f190a8914',1,'operator>(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga640d6afcfb462ced93eefa1b697cd060',1,'operator>(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa37cb32841f9ffa14b1936e05a1ebe9',1,'operator>(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e97195a2b7cecf5ede8e47d260723c',1,'operator>(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga335811f06efddba5e75ce0116d04783a',1,'operator>(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa4f074c9ea9489fd8b41157998c5fed',1,'operator>(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f1e7ce1a6510265ead6b6207f39effc',1,'operator>(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9756cee47606a4de0ca1c3c8e97a40b2',1,'operator>(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d783278f798a238eb375b58e4eeade4',1,'operator>(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab439a8c37814ba930d4f4f0d15095883',1,'operator>(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad508ec58830cc1077eb07e8fc153fd',1,'operator>(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga408471782e6c3338d5ee9de16e31644e',1,'operator>(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35415f4fd50ebd8a203fef079c54ec8d',1,'operator>(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14fe180ed1d9c9666c46e88a36c421a8',1,'operator>(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab45d33bf92b38f1331208282fda45064',1,'operator>(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c384571fec644fe63911fd26bf6e6b',1,'operator>(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31473d08b4bb642729365caf9a6c0e39',1,'operator>(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa100c0ecc7e8aec9341b40562ac55b3a',1,'operator>(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb98ebc2ade19b8e960fa40f5d6a253e',1,'operator>(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eaa0d1ca6c4bb54774350171b9e16b5',1,'operator>(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6458afcdc07e562050e4315122f859d2',1,'operator>(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d2cc8c1b0507e85f915853485ecc6d0',1,'operator>(double s, const double1 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a4888830ee6fb21e7bb62e14a2ab70ba2',1,'__gnu_cxx::operator>(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a15ea80c5370562c6713c383c5277c3c0',1,'__gnu_cxx::operator>(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a3137c36cfc4f7bc7580eb06bc8d2845c',1,'__gnu_cxx::operator>(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a886fc839debeebe4e1453774a028d1e3',1,'std::operator>(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6116f2ba6a75587900983e4a6662a528',1,'std::operator>(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga00de6fe7684f71fc08bad81b4bc65c52',1,'std::operator>(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afd4ebca607a5d77bce0ce62ed7c86fb9',1,'std::operator>(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a76a6b1542f3e854da212df3a9046cd05',1,'std::operator>(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaec6e1b27604a07cb7a1158c0a1da0810',1,'std::operator>(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga61879ec22c8f941d3bc5a6f57f094779',1,'std::operator>(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a14156f76400cead9187280c59587a8f1',1,'std::operator>(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20e59f399d0143cf0517ed705d5f095a',1,'std::operator>(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5554501d29b4f818450c37cbf8e3b403',1,'std::operator>(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga99794cccf99b31cbb9c80f20ff638cc0',1,'std::operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaaee0b4d314905566d4d083f1f3cabfa4',1,'std::operator>(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a1d46b9793f5a9a6d38267007fabb0e05',1,'std::operator>(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac70654ce03713da520f19dc5a9a87edc',1,'std::operator>(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1bdb78aca267183451bbd59a262f52c9',1,'std::operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a3a727df15fd08af612b872262e50a95f',1,'std::operator>(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7788944c30c3070441dc376df8beb210',1,'std::operator>(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af745511bf2598950056525a3fd7a346b',1,'std::operator>(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a56282963f192a45f81f55fa9c6a8005a',1,'std::operator>(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0f0b7503d67a8bd548778912aa40de84',1,'std::operator>(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab05d57b2cc8854cbdb97bc0676abf2c0',1,'std::operator>(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a84b60842f88cb57f0075a964c68794b5',1,'std::__debug::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a8885d72d87c6b3b0441124b7e625b92d',1,'std::__profile::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#a05cd508a43f05f31e7fb298edd7a84e1',1,'std::rel_ops::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gabc26fba16414cb3d2c1247de4be61cfd',1,'std::tr2::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gabc26fba16414cb3d2c1247de4be61cfd',1,'operator>(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaec6e1b27604a07cb7a1158c0a1da0810',1,'operator>(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga61879ec22c8f941d3bc5a6f57f094779',1,'operator>(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20e59f399d0143cf0517ed705d5f095a',1,'operator>(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5554501d29b4f818450c37cbf8e3b403',1,'operator>(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga99794cccf99b31cbb9c80f20ff638cc0',1,'operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaaee0b4d314905566d4d083f1f3cabfa4',1,'operator>(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1bdb78aca267183451bbd59a262f52c9',1,'operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga00de6fe7684f71fc08bad81b4bc65c52',1,'operator>(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], - ['operator_3e_3d_343',['operator>=',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a39f3eecb2debd3e05e155d8769597994',1,'cv::MatExpr::operator>=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a908e8895c1daab24e5e8be7b9adddf12',1,'cv::MatExpr::operator>=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae5acab862f659f77658f59c723791d2d',1,'cv::MatExpr::operator>=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#afb86a86ce5bdb62722ad6a2c38eb2279',1,'cv::MatExpr::operator>=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac87dbdcc89fc97aff6e94ff635da8949',1,'cv::MatExpr::operator>=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a39f3eecb2debd3e05e155d8769597994',1,'cv::MatExpr::operator>=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a908e8895c1daab24e5e8be7b9adddf12',1,'cv::MatExpr::operator>=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae5acab862f659f77658f59c723791d2d',1,'cv::MatExpr::operator>=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#afb86a86ce5bdb62722ad6a2c38eb2279',1,'cv::MatExpr::operator>=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac87dbdcc89fc97aff6e94ff635da8949',1,'cv::MatExpr::operator>=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga7523b2303cf5a3e9343147742f277149',1,'cv::softdouble::operator>=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3899c1c417984a878e1623a12f364a6b',1,'cv::softfloat::operator>=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a74a943800c7f103d0990d7eef82c6453.html#a74a943800c7f103d0990d7eef82c6453',1,'nlohmann::basic_json::operator>='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab83d11de4db25633f93e067aa218cae9.html#ab83d11de4db25633f93e067aa218cae9',1,'nlohmann::basic_json::operator>='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a94c61e0128f0794e7a34e1aecee5c445.html#a94c61e0128f0794e7a34e1aecee5c445',1,'nlohmann::basic_json::operator>='],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga192e4da1bbd83aa64b5e2e86dba8f9e9',1,'cv::operator>=()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5330cc80f66e09053ad401da24bfe0',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55b886854f93ec539b81f73de542c40d',1,'cv::cudev::operator>=(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61c7293a315c1910a0d1c6bf5963a67f',1,'cv::cudev::operator>=(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1373cae04cbfcbed044238b4c0012f52',1,'cv::cudev::operator>=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66183c3c065c37807ae7a9aac89d9683',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b53ea181ce1eb43fe1ae329325e99e8',1,'cv::cudev::operator>=(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59dbec8b57764f129596bdbcdd1e3562',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga204eca640e93cedab25090194331d1e2',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d31376fae318ac2ab9434b0d4722af',1,'cv::cudev::operator>=(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad95a5e9db7d69228b51369c9c896b56a',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89fd435cb3c2b6f23d64a7f3b4819810',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb2b192959982b295e1f878e1566591',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc12a2670b0ad46ad9469d31eebddf1b',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e8c18e6ea5465dcb4e5ac9943b2dfd5',1,'cv::cudev::operator>=(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43f457f9623ab455d55dd8f1d0327f71',1,'cv::cudev::operator>=(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5aecb08d3a88db58f50c4fb709b7933',1,'cv::cudev::operator>=(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb4d3916b4d585e3643669ec78803951',1,'cv::cudev::operator>=(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6029848613f09b4123c7938a88c53a',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0815757e177f6d5b7721244f12f6903',1,'cv::cudev::operator>=(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3fcf73436590c1ce9ad286097fe9cfc',1,'cv::cudev::operator>=(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f31eca1742f7f20d7e80cac55cbffe6',1,'cv::cudev::operator>=(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ed0450c5195379d076650cf1be91169',1,'cv::cudev::operator>=(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf4d4a962b7b8c6ca198d746416b5c3d',1,'cv::cudev::operator>=(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga477ddd386db964f74d70293d7687b0c8',1,'cv::cudev::operator>=(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7765769643c89f70c73d35ec4a3cadd',1,'cv::cudev::operator>=(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c680c140830f6d38dd143b428e2f4',1,'cv::cudev::operator>=(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf21a4fde0acb285c32c1d56008abcf41',1,'cv::cudev::operator>=(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3afa887b077a0f377b27f72350df7259',1,'cv::cudev::operator>=(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed44ab15e814fce58a672cdb92eaaaf0',1,'cv::cudev::operator>=(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8406f156d41ec17be418590d2e953a74',1,'cv::cudev::operator>=(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1f9c52c48f29114947a08f0984cc23',1,'cv::cudev::operator>=(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga539493c0b07035d7e67d87bd68856ca4',1,'cv::cudev::operator>=(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef31a3f97ef6709045c6c5e280dffef1',1,'cv::cudev::operator>=(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547d2e06b7c5d87d0392acfbbb350e3d',1,'cv::cudev::operator>=(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebe853d079262445e933d64c232dea87',1,'cv::cudev::operator>=(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b136da085c473eec683b0d25665d999',1,'cv::cudev::operator>=(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abf293a57acdb1d193efdbeb48850b7',1,'cv::cudev::operator>=(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc74e9748c7d824f4c402e7443157efd',1,'cv::cudev::operator>=(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4cfc621933360fd6c3a21434b90477a',1,'cv::cudev::operator>=(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade5ffb51464ed9a304c6ccf1eea95bff',1,'cv::cudev::operator>=(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba4b299c1f9f39e23300e9dda97f1a5',1,'cv::cudev::operator>=(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga588bf5d735442049d6513d94884fcd33',1,'cv::cudev::operator>=(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3c9bc60881121216c407af1a319ed6',1,'cv::cudev::operator>=(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6951e256e5788320f1eca5105f76596f',1,'cv::cudev::operator>=(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8694d45c659b1fee5f7806e99aac8e7',1,'cv::cudev::operator>=(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d6eedcf500e803f32a17150b27968a5',1,'cv::cudev::operator>=(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f344776a2bbd8f29184a166ef092af2',1,'cv::cudev::operator>=(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e41bcdfabc98e9ec2de85bc163826b5',1,'cv::cudev::operator>=(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f33674629adbf0b08b4fb78c25495cc',1,'cv::cudev::operator>=(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1dada72f050c77f7e18d2bf96c8e376',1,'cv::cudev::operator>=(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab363efde6df231138d5222b1b6bd48f3',1,'cv::cudev::operator>=(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb8f7ad533a2657bd11aabdcdd7ee987',1,'cv::cudev::operator>=(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a68b7438b043a42d8732d97012003f5',1,'cv::cudev::operator>=(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4154e5c15631b66c54787029ebc990c3',1,'cv::cudev::operator>=(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45a21bb3cd57a2e993037143309e84e1',1,'cv::cudev::operator>=(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dc323ca96973f3bb10ea8ff03296b78',1,'cv::cudev::operator>=(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08b0e1e9ffda58046cd9889f7068e649',1,'cv::cudev::operator>=(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4edddce6542f00b2cb1de230437ba40b',1,'cv::cudev::operator>=(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24927de1bc04bacffcbb04310862f2e',1,'cv::cudev::operator>=(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb3f698e36d064129d4414b2ad6a9a3e',1,'cv::cudev::operator>=(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ccf77a9b8d87c2980e3d2f435125264',1,'cv::cudev::operator>=(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga249d6a87d32bd5ad9f4e22f32ccd632a',1,'cv::cudev::operator>=(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b591de78c118edddff4887525e0c5d9',1,'cv::cudev::operator>=(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaac862fd70672e334a90773b88267455',1,'cv::cudev::operator>=(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga775f874d3cba778e3c0cae929b525fc8',1,'cv::cudev::operator>=(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4590cd1de2f1f07aa520e168ea968c27',1,'cv::cudev::operator>=(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e5b8010cca18aab7e53847d1133ce81',1,'cv::cudev::operator>=(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85ba6a29fe83842bfffc726e582b5ee3',1,'cv::cudev::operator>=(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e36f2665d9739cc06ae0cb2562e8c0',1,'cv::cudev::operator>=(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e320de3bce9ed33ff9c8fc57be6d39',1,'cv::cudev::operator>=(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad59ee5976df102e72b1ff749231c9f47',1,'cv::cudev::operator>=(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67126297a64ef25f2c3194020fca3cad',1,'cv::cudev::operator>=(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a68b5ab03282686225ed7b88012c4b',1,'cv::cudev::operator>=(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae68aad51dc7f176ef197ee8c43c3a41d',1,'cv::cudev::operator>=(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga474292d4a9c6579fc2d31c9dcdcaa971',1,'cv::cudev::operator>=(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee757427c34f7ec54713ef3daae854ef',1,'cv::cudev::operator>=(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73786eb58807a17a538c755e34d9675d',1,'cv::cudev::operator>=(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab24f6ed6cb8e1e447b97a75be6654f7f',1,'cv::cudev::operator>=(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae61d709025c856d3146d10cb7e788d75',1,'cv::cudev::operator>=(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga802b60c4cd50658153f7e88b252935c5',1,'cv::cudev::operator>=(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab681691fbf17f68b4e9d588645b08116',1,'cv::cudev::operator>=(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d8502df0ee39c8dbae6ae47d4806b8a',1,'cv::cudev::operator>=(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8ffbcfb9495f8eea8cde1af08039d6',1,'cv::cudev::operator>=(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcbec3693958703c755c64ce0937ba3',1,'cv::cudev::operator>=(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7768c8e69a236df27818762a8f104c35',1,'cv::cudev::operator>=(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6879e2b18878ecceaab7af951c8d02fc',1,'cv::cudev::operator>=(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacacfa7f605da556808ffabf98be76b0',1,'cv::cudev::operator>=(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa4b9df279731155760f059dbe663be7',1,'cv::cudev::operator>=(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga932feafc496906a1677f88fc87ea080b',1,'cv::cudev::operator>=(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0b5d7bde9d408e0589cd5f21072be91',1,'cv::cudev::operator>=(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053ac7b33a7fdc5d34218983001f0f43',1,'cv::cudev::operator>=(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c72029e1748eb9921b128c7e1306487',1,'cv::cudev::operator>=(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga646651e94a7b468f128be9c30a448e94',1,'cv::cudev::operator>=(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f6ccf218473b80b7b2dcc253febdc9a',1,'cv::cudev::operator>=(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9507310e4ad6cfcbca66c2fd7c7082f',1,'cv::cudev::operator>=(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b1151c7a2a2ddd85dcf62518c58d49',1,'cv::cudev::operator>=(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0edff402253aa4596b3dc6854b6af18e',1,'cv::cudev::operator>=(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1531b3d6906a273b4cf9e8c56e19caa',1,'cv::cudev::operator>=(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fbf32a1fa03bb675190ebd2adb3ac70',1,'cv::cudev::operator>=(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34384f5470f48a898cd982db515575c3',1,'cv::cudev::operator>=(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2b88160c219e0921cfea0acf8c246c5',1,'cv::cudev::operator>=(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga478501caf9d016ecb74e586aa74a8eff',1,'cv::cudev::operator>=(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga343064aec5bc2570785ee2e4b25f2190',1,'cv::cudev::operator>=(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2eab9bc4ae70aa428b0a54595b4d1b2',1,'cv::cudev::operator>=(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad08e83716e56a26fe1d0e187f0d119c0',1,'cv::cudev::operator>=(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4010de5c35fd52658f696ef5106f8d8b',1,'cv::cudev::operator>=(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6abb0e15698a012d2de983ded0ab3030',1,'cv::cudev::operator>=(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d8af3d392d78262551dea823f822220',1,'cv::cudev::operator>=(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2ed51d9bd9237ec4ee957a2861de80d7',1,'cv::cudev::operator>=(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae5341fc17764c044f28d7510fd879d',1,'cv::cudev::operator>=(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510b88a926bd78ed6550626a57f297f5',1,'cv::cudev::operator>=(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a824a0f0b67806b6db61f3532ec2c97',1,'cv::cudev::operator>=(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95c4a13893450c74268cecbb7a4d47a7',1,'cv::cudev::operator>=(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ddf2b8e66168e64e5baec6ce0e558e',1,'cv::cudev::operator>=(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e68f9ecf09b25e36f1530afba43747d',1,'cv::cudev::operator>=(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4827daed85d7647479290921fae85f9',1,'cv::cudev::operator>=(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga731e1a86a51c771a75d83daa958df9e0',1,'cv::cudev::operator>=(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1f457d5eb24579073db8c8c0dd3d1ad',1,'cv::cudev::operator>=(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8e092faec9f57baa41674711a444ea',1,'cv::cudev::operator>=(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga541f5919f746411f043d670afb3ba7b3',1,'cv::cudev::operator>=(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3899c1c417984a878e1623a12f364a6b',1,'operator>=(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga7523b2303cf5a3e9343147742f277149',1,'operator>=(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga192e4da1bbd83aa64b5e2e86dba8f9e9',1,'operator>=(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5330cc80f66e09053ad401da24bfe0',1,'operator>=(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55b886854f93ec539b81f73de542c40d',1,'operator>=(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61c7293a315c1910a0d1c6bf5963a67f',1,'operator>=(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1373cae04cbfcbed044238b4c0012f52',1,'operator>=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66183c3c065c37807ae7a9aac89d9683',1,'operator>=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b53ea181ce1eb43fe1ae329325e99e8',1,'operator>=(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59dbec8b57764f129596bdbcdd1e3562',1,'operator>=(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga204eca640e93cedab25090194331d1e2',1,'operator>=(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d31376fae318ac2ab9434b0d4722af',1,'operator>=(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad95a5e9db7d69228b51369c9c896b56a',1,'operator>=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89fd435cb3c2b6f23d64a7f3b4819810',1,'operator>=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb2b192959982b295e1f878e1566591',1,'operator>=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc12a2670b0ad46ad9469d31eebddf1b',1,'operator>=(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e8c18e6ea5465dcb4e5ac9943b2dfd5',1,'operator>=(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43f457f9623ab455d55dd8f1d0327f71',1,'operator>=(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5aecb08d3a88db58f50c4fb709b7933',1,'operator>=(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb4d3916b4d585e3643669ec78803951',1,'operator>=(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6029848613f09b4123c7938a88c53a',1,'operator>=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0815757e177f6d5b7721244f12f6903',1,'operator>=(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3fcf73436590c1ce9ad286097fe9cfc',1,'operator>=(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f31eca1742f7f20d7e80cac55cbffe6',1,'operator>=(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ed0450c5195379d076650cf1be91169',1,'operator>=(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf4d4a962b7b8c6ca198d746416b5c3d',1,'operator>=(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga477ddd386db964f74d70293d7687b0c8',1,'operator>=(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7765769643c89f70c73d35ec4a3cadd',1,'operator>=(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c680c140830f6d38dd143b428e2f4',1,'operator>=(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf21a4fde0acb285c32c1d56008abcf41',1,'operator>=(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3afa887b077a0f377b27f72350df7259',1,'operator>=(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed44ab15e814fce58a672cdb92eaaaf0',1,'operator>=(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8406f156d41ec17be418590d2e953a74',1,'operator>=(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1f9c52c48f29114947a08f0984cc23',1,'operator>=(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga539493c0b07035d7e67d87bd68856ca4',1,'operator>=(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef31a3f97ef6709045c6c5e280dffef1',1,'operator>=(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547d2e06b7c5d87d0392acfbbb350e3d',1,'operator>=(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebe853d079262445e933d64c232dea87',1,'operator>=(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b136da085c473eec683b0d25665d999',1,'operator>=(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abf293a57acdb1d193efdbeb48850b7',1,'operator>=(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc74e9748c7d824f4c402e7443157efd',1,'operator>=(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4cfc621933360fd6c3a21434b90477a',1,'operator>=(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade5ffb51464ed9a304c6ccf1eea95bff',1,'operator>=(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba4b299c1f9f39e23300e9dda97f1a5',1,'operator>=(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga588bf5d735442049d6513d94884fcd33',1,'operator>=(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3c9bc60881121216c407af1a319ed6',1,'operator>=(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6951e256e5788320f1eca5105f76596f',1,'operator>=(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8694d45c659b1fee5f7806e99aac8e7',1,'operator>=(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d6eedcf500e803f32a17150b27968a5',1,'operator>=(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f344776a2bbd8f29184a166ef092af2',1,'operator>=(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e41bcdfabc98e9ec2de85bc163826b5',1,'operator>=(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f33674629adbf0b08b4fb78c25495cc',1,'operator>=(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1dada72f050c77f7e18d2bf96c8e376',1,'operator>=(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab363efde6df231138d5222b1b6bd48f3',1,'operator>=(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb8f7ad533a2657bd11aabdcdd7ee987',1,'operator>=(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a68b7438b043a42d8732d97012003f5',1,'operator>=(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4154e5c15631b66c54787029ebc990c3',1,'operator>=(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45a21bb3cd57a2e993037143309e84e1',1,'operator>=(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dc323ca96973f3bb10ea8ff03296b78',1,'operator>=(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08b0e1e9ffda58046cd9889f7068e649',1,'operator>=(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4edddce6542f00b2cb1de230437ba40b',1,'operator>=(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24927de1bc04bacffcbb04310862f2e',1,'operator>=(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb3f698e36d064129d4414b2ad6a9a3e',1,'operator>=(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ccf77a9b8d87c2980e3d2f435125264',1,'operator>=(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga249d6a87d32bd5ad9f4e22f32ccd632a',1,'operator>=(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b591de78c118edddff4887525e0c5d9',1,'operator>=(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaac862fd70672e334a90773b88267455',1,'operator>=(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga775f874d3cba778e3c0cae929b525fc8',1,'operator>=(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4590cd1de2f1f07aa520e168ea968c27',1,'operator>=(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e5b8010cca18aab7e53847d1133ce81',1,'operator>=(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85ba6a29fe83842bfffc726e582b5ee3',1,'operator>=(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e36f2665d9739cc06ae0cb2562e8c0',1,'operator>=(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e320de3bce9ed33ff9c8fc57be6d39',1,'operator>=(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad59ee5976df102e72b1ff749231c9f47',1,'operator>=(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67126297a64ef25f2c3194020fca3cad',1,'operator>=(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a68b5ab03282686225ed7b88012c4b',1,'operator>=(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae68aad51dc7f176ef197ee8c43c3a41d',1,'operator>=(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga474292d4a9c6579fc2d31c9dcdcaa971',1,'operator>=(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee757427c34f7ec54713ef3daae854ef',1,'operator>=(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73786eb58807a17a538c755e34d9675d',1,'operator>=(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab24f6ed6cb8e1e447b97a75be6654f7f',1,'operator>=(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae61d709025c856d3146d10cb7e788d75',1,'operator>=(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga802b60c4cd50658153f7e88b252935c5',1,'operator>=(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab681691fbf17f68b4e9d588645b08116',1,'operator>=(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d8502df0ee39c8dbae6ae47d4806b8a',1,'operator>=(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8ffbcfb9495f8eea8cde1af08039d6',1,'operator>=(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcbec3693958703c755c64ce0937ba3',1,'operator>=(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7768c8e69a236df27818762a8f104c35',1,'operator>=(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6879e2b18878ecceaab7af951c8d02fc',1,'operator>=(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacacfa7f605da556808ffabf98be76b0',1,'operator>=(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa4b9df279731155760f059dbe663be7',1,'operator>=(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga932feafc496906a1677f88fc87ea080b',1,'operator>=(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0b5d7bde9d408e0589cd5f21072be91',1,'operator>=(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053ac7b33a7fdc5d34218983001f0f43',1,'operator>=(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c72029e1748eb9921b128c7e1306487',1,'operator>=(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga646651e94a7b468f128be9c30a448e94',1,'operator>=(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f6ccf218473b80b7b2dcc253febdc9a',1,'operator>=(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9507310e4ad6cfcbca66c2fd7c7082f',1,'operator>=(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b1151c7a2a2ddd85dcf62518c58d49',1,'operator>=(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0edff402253aa4596b3dc6854b6af18e',1,'operator>=(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1531b3d6906a273b4cf9e8c56e19caa',1,'operator>=(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fbf32a1fa03bb675190ebd2adb3ac70',1,'operator>=(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34384f5470f48a898cd982db515575c3',1,'operator>=(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2b88160c219e0921cfea0acf8c246c5',1,'operator>=(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga478501caf9d016ecb74e586aa74a8eff',1,'operator>=(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga343064aec5bc2570785ee2e4b25f2190',1,'operator>=(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2eab9bc4ae70aa428b0a54595b4d1b2',1,'operator>=(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad08e83716e56a26fe1d0e187f0d119c0',1,'operator>=(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4010de5c35fd52658f696ef5106f8d8b',1,'operator>=(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6abb0e15698a012d2de983ded0ab3030',1,'operator>=(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d8af3d392d78262551dea823f822220',1,'operator>=(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2ed51d9bd9237ec4ee957a2861de80d7',1,'operator>=(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae5341fc17764c044f28d7510fd879d',1,'operator>=(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510b88a926bd78ed6550626a57f297f5',1,'operator>=(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a824a0f0b67806b6db61f3532ec2c97',1,'operator>=(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95c4a13893450c74268cecbb7a4d47a7',1,'operator>=(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ddf2b8e66168e64e5baec6ce0e558e',1,'operator>=(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e68f9ecf09b25e36f1530afba43747d',1,'operator>=(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4827daed85d7647479290921fae85f9',1,'operator>=(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga731e1a86a51c771a75d83daa958df9e0',1,'operator>=(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1f457d5eb24579073db8c8c0dd3d1ad',1,'operator>=(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8e092faec9f57baa41674711a444ea',1,'operator>=(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga541f5919f746411f043d670afb3ba7b3',1,'operator>=(double s, const double1 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a1ec2deb39f1b5127f5a8bb2b26450c03',1,'__gnu_cxx::operator>=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a9fd2a7c53cf7d775379e0d6097658545',1,'__gnu_cxx::operator>=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#aa626858a9a44d7932ad8c38fb4905b34',1,'__gnu_cxx::operator>=(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a11bb9b3800196c309babae27f4b4a900',1,'std::operator>=(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac65d320a052a5d4d1477ef25b5627be5',1,'std::operator>=(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga4abfa75dbeb7ee6922ab97aaaba57d47',1,'std::operator>=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acddc46a5f1205d53f5f682a89259c38e',1,'std::operator>=(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abf5b635cc4dfc9f737e9a3933b6d7e06',1,'std::operator>=(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga9ee66c57996b60af8514834ba5054af4',1,'std::operator>=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga81455a2af5c1721d3340fa06eaccfe06',1,'std::operator>=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a69dd44d827cf392b3490c7498d47cd5b',1,'std::operator>=(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa4a816fd640e88c0b2e9b0bb6cc4cb19',1,'std::operator>=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga86523db2bbd873f4bc26c42a77f443b3',1,'std::operator>=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1225fba40c8af2c834e8201af601829b',1,'std::operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga71a6363d6cad986521d5f5a1537a1e06',1,'std::operator>=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8bd7da47a9941d7e825411420feb6ac1',1,'std::operator>=(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a03f03b3697da916e95a09b1488df52df',1,'std::operator>=(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fdb938850a723e8e447fce21fc0b7c2',1,'std::operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9a32938be630f180eddc69f0402d13ca',1,'std::operator>=(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a628eda81f6cb2988d8f5908f631cdb46',1,'std::operator>=(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5e3f58e54e9cbbcda75328fada9fa1a5',1,'std::operator>=(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4fd05c4c42075e6787d13b7dd454ba77',1,'std::operator>=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a56fe512b61535754991c71651054a4a3',1,'std::operator>=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad9ef507927a631a73f69c9d4d8add693',1,'std::operator>=(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a636d8ef229361158ab4945c00d7676be',1,'std::__debug::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a73aff27c428faa615874629ae0250e64',1,'std::__profile::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#ac93a7559412662f6dfd7c206ecb98f99',1,'std::rel_ops::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga08b65275697884e0facdf36f73c0bb7d',1,'std::tr2::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga08b65275697884e0facdf36f73c0bb7d',1,'operator>=(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga9ee66c57996b60af8514834ba5054af4',1,'operator>=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga81455a2af5c1721d3340fa06eaccfe06',1,'operator>=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa4a816fd640e88c0b2e9b0bb6cc4cb19',1,'operator>=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga86523db2bbd873f4bc26c42a77f443b3',1,'operator>=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1225fba40c8af2c834e8201af601829b',1,'operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga71a6363d6cad986521d5f5a1537a1e06',1,'operator>=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fdb938850a723e8e447fce21fc0b7c2',1,'operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga4abfa75dbeb7ee6922ab97aaaba57d47',1,'operator>=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], - ['operator_3e_3e_344',['operator>>',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aeff689aa3f1d9e49c24e22b097d17b04',1,'cv::FileNode::operator>>(const FileNode &n, _Tp &value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a4e6bc57b90b1336bc5fdaa055c5295cc',1,'cv::FileNode::operator>>(const FileNode &n, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a002a7403a3c77de6fdb3e080cf4657db',1,'cv::FileNode::operator>>(const FileNode &n, KeyPoint &kpt)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9137a05efd7738001795800234e73eef',1,'cv::FileNode::operator>>(const FileNode &n, DMatch &m)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aeff689aa3f1d9e49c24e22b097d17b04',1,'cv::FileNode::operator>>(const FileNode &n, _Tp &value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a4e6bc57b90b1336bc5fdaa055c5295cc',1,'cv::FileNode::operator>>(const FileNode &n, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a002a7403a3c77de6fdb3e080cf4657db',1,'cv::FileNode::operator>>(const FileNode &n, KeyPoint &kpt)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9137a05efd7738001795800234e73eef',1,'cv::FileNode::operator>>(const FileNode &n, DMatch &m)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a0e9987928ef46a3fe99b3fe02b659dd4',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, _Tp &value)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a1b91e417a7103145b4997e086aec99df',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a0e9987928ef46a3fe99b3fe02b659dd4',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, _Tp &value)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a1b91e417a7103145b4997e086aec99df',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a199844fb74226a28b3ce3a39d1ff6765',1,'cv::VideoCapture::operator>>(Mat &image)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a35eb427f16b4ea5c502922aba9da835c',1,'cv::VideoCapture::operator>>(UMat &image)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'basic_iostream< char >::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'basic_iostream< char >::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_iostream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_iostream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_iostream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_iostream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_iostream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_iostream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_iostream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_iostream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_iostream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_iostream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_iostream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_iostream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_iostream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_iostream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_iostream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_iostream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_iostream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_iostream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_iostream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_iostream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_iostream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_iostream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_iostream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_iostream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_iostream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_iostream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_iostream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_iostream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_iostream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_iostream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'basic_istream< char >::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'basic_istream< char >::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'basic_istream< char, _Traits >::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'basic_istream< char, _Traits >::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char, _Traits >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char, _Traits >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char, _Traits >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char, _Traits >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char, _Traits >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char, _Traits >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char, _Traits >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char, _Traits >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char, _Traits >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char, _Traits >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char, _Traits >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char, _Traits >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char, _Traits >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char, _Traits >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char, _Traits >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char, _Traits >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char, _Traits >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char, _Traits >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char, _Traits >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char, _Traits >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char, _Traits >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char, _Traits >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char, _Traits >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char, _Traits >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char, _Traits >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char, _Traits >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char, _Traits >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char, _Traits >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char, _Traits >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char, _Traits >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#abe79b6964f9b74c546de48e9c34c7388',1,'gamma_distribution< double >::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#abe79b6964f9b74c546de48e9c34c7388',1,'gamma_distribution< result_type >::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a4fe6e606a61991ce6007b14402043497',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ac440bfeab944ac2efe370a05088ed47c',1,'normal_distribution< double >::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ac440bfeab944ac2efe370a05088ed47c',1,'normal_distribution< result_type >::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_fstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_fstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_fstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_fstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_fstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_fstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_fstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_fstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_fstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_fstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_fstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_fstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_fstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_fstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_fstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_fstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_fstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_fstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_fstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_fstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_fstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_fstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_fstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_fstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_fstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_fstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_fstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_fstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_fstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_fstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_fstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_fstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_ifstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_ifstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_ifstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_ifstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_ifstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_ifstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_ifstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_ifstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_ifstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_ifstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_ifstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_ifstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_ifstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_ifstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_ifstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_ifstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_ifstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_ifstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_ifstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_ifstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_ifstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_ifstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_ifstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_ifstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_ifstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_ifstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_ifstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_ifstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_ifstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_ifstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_ifstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_ifstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_iostream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_iostream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_iostream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_iostream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_iostream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_iostream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_iostream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_iostream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_iostream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_iostream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_iostream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_iostream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_iostream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_iostream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_iostream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_iostream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_iostream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_iostream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_iostream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_iostream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_iostream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_iostream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_iostream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_iostream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_iostream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_iostream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_iostream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_iostream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_iostream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_iostream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_iostream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_iostream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_istream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_istream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_istringstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_istringstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_stringstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_stringstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_stringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_stringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_stringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_stringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_stringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_stringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_stringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_stringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_stringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_stringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_stringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_stringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_stringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_stringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_stringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_stringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_stringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_stringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_stringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_stringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_stringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_stringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_stringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_stringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_stringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_stringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_stringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_stringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_stringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_stringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a6770ba69c9a9d9b6d45fb2d262b6739d',1,'std::binomial_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aeba729a09e2f6c19b000476fa7eb0fcd',1,'std::bitset::operator>>(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aeba729a09e2f6c19b000476fa7eb0fcd',1,'std::bitset::operator>>(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a5c7725e75b4c3fec1a13c3258ceaa6bc',1,'std::chi_squared_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a47191ff90d26d583cadb261b7de61c1d',1,'std::discard_block_engine::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#aab065c34d9b99c0ffaaed26759eb193c',1,'std::discrete_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#abab2538be3fead2df80ac93a9ebaa7f3',1,'std::fisher_f_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#abe79b6964f9b74c546de48e9c34c7388',1,'std::gamma_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a13e9be7110a9e32004584ac71de9190f',1,'std::independent_bits_engine::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a337332c3de4a035002d715e35f79c49f',1,'std::linear_congruential_engine::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#a21983da6e9b4301e89130f48917e139b',1,'std::lognormal_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a4fe6e606a61991ce6007b14402043497',1,'std::mersenne_twister_engine::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#a93bd5f1af62bc168064fa22619bc1604',1,'std::negative_binomial_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ac440bfeab944ac2efe370a05088ed47c',1,'std::normal_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#aa000eee610a97f1fc2c8a45e44d67c71',1,'std::piecewise_constant_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#af90a22b42c0c9a7458f57e07738e2a18',1,'std::piecewise_linear_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#ada1ead00f77a845a7dad6a50e38abe2e',1,'std::poisson_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#ab19d98410e08562d78ed353f60ad4fc7',1,'std::shuffle_order_engine::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a23626484794f6d9d4377d3fa16989f91',1,'std::student_t_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a0420033b44c3e22e2157546faa851f00',1,'std::subtract_with_carry_engine::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae9a03a35d703cdbbf1155330a59eed57',1,'std::tr2::dynamic_bitset::operator>>(size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae9a03a35d703cdbbf1155330a59eed57',1,'std::tr2::dynamic_bitset::operator>>(size_type __pos) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a34d6a60dd99e9f33b8273a1c8db5669b.html#a34d6a60dd99e9f33b8273a1c8db5669b',1,'nlohmann::basic_json::operator>>'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aaf363408931d76472ded14017e59c9e8.html#aaf363408931d76472ded14017e59c9e8',1,'nlohmann::basic_json::operator>>'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaae9733cc2b353835e1a8723dcfc171e2',1,'cv::operator>>()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a685b4cdb4af2a8d7a68fbfcd8e2548',1,'cv::cudev::operator>>(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga837d4419807a80ee32b3c961913cb7e4',1,'cv::cudev::operator>>(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefe26fd801b0820623044113109b13ec',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490716b718d4dd43c89d51694861843b',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5290b7ec0ee646136f388beb08e115f8',1,'cv::cudev::operator>>(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2d998b1143eae5f5d4f6cfebdfb00df',1,'cv::cudev::operator>>(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9af265df70ba6c6606a9384e989ae155',1,'cv::cudev::operator>>(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23a3e1f1df0cc826fa1e31152ef3c721',1,'cv::cudev::operator>>(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f3301b8bc25bdd2cb00ee98a81030b4',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c5c20ba9fe5527ded3ff0fd72f53cbf',1,'cv::cudev::operator>>(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05f308ef809ecd39ef9985554956d16a',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad327490c86961a8f0a65abc413fa546f',1,'cv::cudev::operator>>(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b60617070fde498fd3217af505e0c1',1,'cv::cudev::operator>>(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147aab19cdedc271193e916d905e7caf',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056be68e684c65e2836b5ef1b8089d3f',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac382672463e961bd8ab509e436b94494',1,'cv::cudev::operator>>(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa742399be625c93c587e8c358d0885cc',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga659b874a5439f4483fc9c1a7f6ea5d1f',1,'cv::cudev::operator>>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa23bb682b46b78eef7c4c6febadd786c',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3fe97f46e29307fc51714496a0de0e3',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70f05e9528501005e278d9767f670818',1,'cv::cudev::operator>>(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e10e34970a384ffc99c5a56d78098bb',1,'cv::cudev::operator>>(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga036cb20b4c06864975ca4df3a6a7e1c3',1,'cv::cudev::operator>>(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dfe8d94a8059fea9c67a71fe1654cbf',1,'cv::cudev::operator>>(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaae9733cc2b353835e1a8723dcfc171e2',1,'operator>>(const v_reg< _Tp, n > &a, int imm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a685b4cdb4af2a8d7a68fbfcd8e2548',1,'operator>>(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga837d4419807a80ee32b3c961913cb7e4',1,'operator>>(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefe26fd801b0820623044113109b13ec',1,'operator>>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490716b718d4dd43c89d51694861843b',1,'operator>>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5290b7ec0ee646136f388beb08e115f8',1,'operator>>(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2d998b1143eae5f5d4f6cfebdfb00df',1,'operator>>(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9af265df70ba6c6606a9384e989ae155',1,'operator>>(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23a3e1f1df0cc826fa1e31152ef3c721',1,'operator>>(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f3301b8bc25bdd2cb00ee98a81030b4',1,'operator>>(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c5c20ba9fe5527ded3ff0fd72f53cbf',1,'operator>>(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05f308ef809ecd39ef9985554956d16a',1,'operator>>(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad327490c86961a8f0a65abc413fa546f',1,'operator>>(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b60617070fde498fd3217af505e0c1',1,'operator>>(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147aab19cdedc271193e916d905e7caf',1,'operator>>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056be68e684c65e2836b5ef1b8089d3f',1,'operator>>(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac382672463e961bd8ab509e436b94494',1,'operator>>(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa742399be625c93c587e8c358d0885cc',1,'operator>>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga659b874a5439f4483fc9c1a7f6ea5d1f',1,'operator>>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa23bb682b46b78eef7c4c6febadd786c',1,'operator>>(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3fe97f46e29307fc51714496a0de0e3',1,'operator>>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70f05e9528501005e278d9767f670818',1,'operator>>(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e10e34970a384ffc99c5a56d78098bb',1,'operator>>(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga036cb20b4c06864975ca4df3a6a7e1c3',1,'operator>>(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dfe8d94a8059fea9c67a71fe1654cbf',1,'operator>>(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf81c75e50c9ee8a791d90329d2fc7ef8',1,'std::operator>>(basic_istream< _CharT, _Traits > &__is, complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acda683e8b3ae5f1dd425bb99774304a7',1,'std::operator>>(_Istream &&__is, _Tp &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gab49649ed7cc5cb819ce52620f227b1a7',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_int_distribution< _IntType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gafb5c87acd910ec70edaedef33cf32aee',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_real_distribution< _RealType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a113f151882a47755a4b297813977bbdc',1,'std::operator>>(basic_istream< _CharT, _Traits > &__is, __gnu_cxx::__versa_string< _CharT, _Traits, _Alloc, _Base > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga63a43b47a5315c8b1b55002af2eb1669',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::cauchy_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga2a24c2f5da07f3a713e036875355ad57',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::bernoulli_distribution &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga30ec0007b5169ab3c6847033db603493',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::geometric_distribution< _IntType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5dbbb1871bc0160e0b9cf609e222fb18',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::exponential_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gae0fa60823d48bfd5b1d7a7c0063826ba',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::weibull_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga391e8f9fb533a5fb81f4099e9b03ff6a',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::extreme_value_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6447193cb914c78fb13064c210e26ed8',1,'std::operator>>(basic_istream< _CharT, _Traits > &__is, basic_string< _CharT, _Traits, _Alloc > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a01cd5810d682dec840eee4ed6d2170d4',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, bitset< _Nb > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8f6ffa961cd02381c76b3d3345641f4d',1,'std::operator>>(basic_istream< _CharT, _Traits > &__in, _CharT &__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad29bf992665f01e4a3623420b87f40d3',1,'std::operator>>(basic_istream< char, _Traits > &__in, unsigned char &__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a257b6c1fab9276d9a9ca63c29279d48c',1,'std::operator>>(basic_istream< char, _Traits > &__in, signed char &__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afd645e31e415b300d870dba3de0af813',1,'std::operator>>(basic_istream< _CharT, _Traits > &__in, _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a40a0021a5cf39a79c2ff66d3c31ae277',1,'std::operator>>(basic_istream< char > &__in, char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aefcf45965f6bebc6083ba4d0207cca1d',1,'std::operator>>(basic_istream< char, _Traits > &__in, unsigned char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abcee0d0bbe61b8a00e0336411d295f79',1,'std::operator>>(basic_istream< char, _Traits > &__in, signed char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html#a9dc7b861adff63cefa05b539068f727e',1,'std::__detail::operator>>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga4618b05732d8eec5161f28b23c23227d',1,'std::tr2::operator>>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga2a24c2f5da07f3a713e036875355ad57',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::bernoulli_distribution &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga30ec0007b5169ab3c6847033db603493',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::geometric_distribution< _IntType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf81c75e50c9ee8a791d90329d2fc7ef8',1,'operator>>(basic_istream< _CharT, _Traits > &__is, complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga4618b05732d8eec5161f28b23c23227d',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, dynamic_bitset< _WordT, _Alloc > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga63a43b47a5315c8b1b55002af2eb1669',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::cauchy_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5dbbb1871bc0160e0b9cf609e222fb18',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::exponential_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gae0fa60823d48bfd5b1d7a7c0063826ba',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::weibull_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga391e8f9fb533a5fb81f4099e9b03ff6a',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::extreme_value_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gab49649ed7cc5cb819ce52620f227b1a7',1,'operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_int_distribution< _IntType > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gafb5c87acd910ec70edaedef33cf32aee',1,'operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_real_distribution< _RealType > &)(Global Namespace)']]], - ['operator_3e_3e_3d_345',['operator>>=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac07ef85ee38aa3428883eb50f719cbca',1,'std::bitset::operator>>=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac07ef85ee38aa3428883eb50f719cbca',1,'std::bitset::operator>>=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8293a4feaf1bde96e155e6ba528d0b9a',1,'std::gslice_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga611bd59fab7a43ce79f1707eea03be7a',1,'std::indirect_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga87f02d439b80dd0d351ae9f827c4f77e',1,'std::mask_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7ebc66086e23f1d4bb5cc554fedde16b',1,'std::slice_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab0acb45e7697ddaa619582139a55227e',1,'std::tr2::dynamic_bitset::operator>>=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab0acb45e7697ddaa619582139a55227e',1,'std::tr2::dynamic_bitset::operator>>=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5ce6f32c286043434e864d28271f2069',1,'std::valarray::operator>>=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7f2a41abd2f316f4de7942652da2410d',1,'std::valarray::operator>>=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5ce6f32c286043434e864d28271f2069',1,'valarray< size_t >::operator>>=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7f2a41abd2f316f4de7942652da2410d',1,'valarray< size_t >::operator>>=(const valarray< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8293a4feaf1bde96e155e6ba528d0b9a',1,'operator>>=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5ce6f32c286043434e864d28271f2069',1,'operator>>=(const _Tp &)(Global Namespace)']]], - ['operator_5b_5d_346',['operator[]',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a544bdab727d3b76828c915b0fe30a8e6',1,'cv::FileNode::operator[](const String &nodename) const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a611004b953e5a13140f2d344ed4f6398',1,'cv::FileNode::operator[](const char *nodename) const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a031b7f492abe0f414a7627272bd6e467',1,'cv::FileNode::operator[](int i) const'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#adc7eff268ab95c664657a03e72ed85a5',1,'cv::FileStorage::operator[](const String &nodename) const'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a532f6a27dd57d0f640c6a5a9acddac88',1,'cv::FileStorage::operator[](const char *nodename) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ac04a07edf33eaef0dce8a2c7d5d193b2',1,'cv::cudev::GpuMat_::operator[](int y)'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a1caf23a850242f18af5cab4478b127b5',1,'cv::cudev::GpuMat_::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'cv::Mat_::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'cv::Mat_::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< double >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< double >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< float >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< float >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< uchar >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< uchar >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< unsigned char >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< unsigned char >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#aaf943dc53b7d402993ccc1f44412b594',1,'cv::MatConstIterator::operator[]()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ad9682e4ade6a6f2b83d85b30d94b978f',1,'cv::MatConstIterator_::operator[]()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ab96bf874711db314307ac6a711666e85',1,'cv::MatIterator_::operator[]()'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#aa43c8afeb7e798ea5f1d585d1d3eab93',1,'cv::MatSize::operator[](int i) const'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a8a0c5d3f786fae008a10a6e3bc962215',1,'cv::MatSize::operator[](int i)'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#ae1261117212294e7dbd88c57dc4eb655',1,'cv::MatStep::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a8a4d7e49dff4d9c705e4840a5af56f70',1,'cv::MatStep::operator[](int i)'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#afc4d1e3df056b5fed3c76f0a03a212d4',1,'cv::gapi::own::Scalar::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#aa3d769161bbbcb027050c7e17ff1cade',1,'cv::gapi::own::Scalar::operator[](int i)'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a24367c518aca63c85976897fedd3153a',1,'cv::tbm::Track::operator[](size_t i) const'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#aa202964fa465e9edc7833c848866530c',1,'cv::tbm::Track::operator[](size_t i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'cv::Vec::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'cv::Vec::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< _Tp, 4 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< _Tp, 4 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, 2 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, 2 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, 3 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, 3 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, 4 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, 4 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, nFeatures >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, nFeatures >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< float, 2 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< float, 2 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< float, 3 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< float, 3 >::operator[](int i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab2b57e74d31d0fc2340d2cece8700b4a',1,'__gnu_cxx::__versa_string::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9b58791d4ef7809989f8eaf599f980f1',1,'__gnu_cxx::__versa_string::operator[](size_type __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< _CharT >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< _CharT >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< _CharT, _Traits, _Allocator >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< _CharT, _Traits, _Allocator >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< char >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< char >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< char_type, _Traits, _Alloc >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< char_type, _Traits, _Alloc >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< value_type >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< value_type >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a461a433ad999e2d22e10f45addf1bb67',1,'deque< _StateSeqT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a513a4ab26ac9df40d7ec95fc50e1218b',1,'deque< _StateSeqT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6021c27572ef3bc03cea38c66dde3783',1,'match_results< _Bi_iter >::operator[](size_type __sub) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'match_results< _Bi_iter >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'match_results< _Bi_iter >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6021c27572ef3bc03cea38c66dde3783',1,'match_results< _Bi_iter >::operator[](size_type __sub) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'std::basic_string::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'std::basic_string::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a03ad7ade15b93f22b17648d53ba20062',1,'std::bitset::operator[](size_t __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#afa6b9908b9752384b42da517a3ae3d8c',1,'std::bitset::operator[](size_t __position) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a03ad7ade15b93f22b17648d53ba20062',1,'std::bitset::operator[](size_t __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#afa6b9908b9752384b42da517a3ae3d8c',1,'std::bitset::operator[](size_t __position) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a461a433ad999e2d22e10f45addf1bb67',1,'std::deque::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a513a4ab26ac9df40d7ec95fc50e1218b',1,'std::deque::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a4a4a9f95131baf0713596d672ec36b5f',1,'std::map::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'std::match_results::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'std::match_results::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6021c27572ef3bc03cea38c66dde3783',1,'std::match_results::operator[](size_type __sub) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a4dadeeb9101dbd3d257043519e6e35f8',1,'std::reverse_iterator::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a7b05f8159b467622dc2804f276ecc8ea',1,'std::tr2::dynamic_bitset::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a78022be7125e50468596e2a0e0df4a3b',1,'std::tr2::dynamic_bitset::operator[](size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a7b05f8159b467622dc2804f276ecc8ea',1,'std::tr2::dynamic_bitset::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a78022be7125e50468596e2a0e0df4a3b',1,'std::tr2::dynamic_bitset::operator[](size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a6fb7ee5ca798c98fa24524f0df6edd59',1,'std::unique_ptr< _Tp[], _Dp >::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'std::unordered_map::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'std::unordered_map::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'std::unordered_map::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'std::unordered_map::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2325176078e58966124ec919df2b1eb4',1,'std::valarray::operator[](size_t __i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e86bbdb258433295ab39596449a5f7e',1,'std::valarray::operator[](slice __s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad5394a15e9c7edd4ecece4534d3c3ba3',1,'std::valarray::operator[](slice __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga28ef76e86bd06a99b58af17899554590',1,'std::valarray::operator[](const gslice &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gae5e23cc8dbbeee72c16868aad85731ba',1,'std::valarray::operator[](const gslice &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f454eb267fee574dadea61b69b94d31',1,'std::valarray::operator[](const valarray< bool > &__m) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga24fb191ad805190686652a3a8bf7169b',1,'std::valarray::operator[](const valarray< bool > &__m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2d1a225784345f3c5eb3e94e984e5e00',1,'std::valarray::operator[](const valarray< size_t > &__i) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafcd1719464554185069224f2fd837de3',1,'std::valarray::operator[](const valarray< size_t > &__i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'std::vector::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'std::vector::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2325176078e58966124ec919df2b1eb4',1,'valarray< size_t >::operator[](size_t __i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e86bbdb258433295ab39596449a5f7e',1,'valarray< size_t >::operator[](slice __s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad5394a15e9c7edd4ecece4534d3c3ba3',1,'valarray< size_t >::operator[](slice __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga28ef76e86bd06a99b58af17899554590',1,'valarray< size_t >::operator[](const gslice &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gae5e23cc8dbbeee72c16868aad85731ba',1,'valarray< size_t >::operator[](const gslice &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f454eb267fee574dadea61b69b94d31',1,'valarray< size_t >::operator[](const valarray< bool > &__m) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga24fb191ad805190686652a3a8bf7169b',1,'valarray< size_t >::operator[](const valarray< bool > &__m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2d1a225784345f3c5eb3e94e984e5e00',1,'valarray< size_t >::operator[](const valarray< size_t > &__i) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafcd1719464554185069224f2fd837de3',1,'valarray< size_t >::operator[](const valarray< size_t > &__i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< __diff_type >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< __diff_type >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _CharClassT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _CharClassT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _CharT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _CharT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _Cmpt >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _Cmpt >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _Node *, _Nodeptr_Alloc >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _Node *, _Nodeptr_Alloc >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _RealType >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _RealType >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _State< _TraitsT::char_type > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _State< _TraitsT::char_type > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _StringT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _StringT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< block_type, allocator_type >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< block_type, allocator_type >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< Catalog_info * >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< Catalog_info * >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< double >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< double >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< int >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< int >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< result_type >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< result_type >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< size_t >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< size_t >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< std::pair< _BiIter, int > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< std::pair< _BiIter, int > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< std::pair< _StateIdT, std::vector > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< std::pair< _StateIdT, std::vector > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< sub_match< _BiIter >, _Alloc >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< sub_match< _BiIter >, _Alloc >::operator[](size_type __n) const noexcept'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArithmeticSequence.html#a890959dd45db1bbee103c1861c53ffad',1,'Eigen::ArithmeticSequence::operator[]()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a496672306836589fa04a6ab33cb0cf2a',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::operator[]()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#aa2040f14e60fed1a4a68ca7f042e1bbf',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::operator[]()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9ea67fc1ef0ccc42e1d5388fe0416ae5.html#a9ea67fc1ef0ccc42e1d5388fe0416ae5',1,'nlohmann::basic_json::operator[](size_type idx)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad21d96f490fa1aa8605fba8dadcce319.html#ad21d96f490fa1aa8605fba8dadcce319',1,'nlohmann::basic_json::operator[](size_type idx) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3f45f3820c456ad2e3f3df2926564151.html#a3f45f3820c456ad2e3f3df2926564151',1,'nlohmann::basic_json::operator[](const typename object_t::key_type &key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_acb5b489310f4e0ce2d5fb29b73fb59d3.html#acb5b489310f4e0ce2d5fb29b73fb59d3',1,'nlohmann::basic_json::operator[](const typename object_t::key_type &key) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_abc94831476f7b4d3efe6f2e9036c7188.html#abc94831476f7b4d3efe6f2e9036c7188',1,'nlohmann::basic_json::operator[](T *key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a11bbe874496eb7b29a5549e0637de59e.html#a11bbe874496eb7b29a5549e0637de59e',1,'nlohmann::basic_json::operator[](T *key) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0d3deaa73b3644b4da3f8ef3172cd8d2.html#a0d3deaa73b3644b4da3f8ef3172cd8d2',1,'nlohmann::basic_json::operator[](const json_pointer &ptr)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0a691c29eb7c4acd91ccb498a79cd3ee.html#a0a691c29eb7c4acd91ccb498a79cd3ee',1,'nlohmann::basic_json::operator[](const json_pointer &ptr) const'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_ae7a1ca8c1e234837d137471f73ae6012.html#ae7a1ca8c1e234837d137471f73ae6012',1,'nlohmann::ordered_map::operator[](const Key &key)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a676082659d575e29bdb312bcde53023a.html#a676082659d575e29bdb312bcde53023a',1,'nlohmann::ordered_map::operator[](const Key &key) const'],['../classAR_1_1MarkerSet.html#abb1041eb9fc43bb7919406f08de27784',1,'AR::MarkerSet::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2325176078e58966124ec919df2b1eb4',1,'operator[](size_t __i)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e86bbdb258433295ab39596449a5f7e',1,'operator[](slice __s) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga28ef76e86bd06a99b58af17899554590',1,'operator[](const gslice &__s) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f454eb267fee574dadea61b69b94d31',1,'operator[](const valarray< bool > &__m) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2d1a225784345f3c5eb3e94e984e5e00',1,'operator[](const valarray< size_t > &__i) const(Global Namespace)']]], - ['operator_5e_347',['operator^',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9afbc19e8756efdbc92e17d096540ce5',1,'cv::MatExpr::operator^(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abc36e16ecd042df954771a99068a6c49',1,'cv::MatExpr::operator^(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9867b0d5e11c2fef494b71e51d21da1b',1,'cv::MatExpr::operator^(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a15cd0aff27ba61cb2563894b01547e7e',1,'cv::MatExpr::operator^(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac559f4bd48f3660ee56a223258dc6bb9',1,'cv::MatExpr::operator^(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9afbc19e8756efdbc92e17d096540ce5',1,'cv::MatExpr::operator^(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abc36e16ecd042df954771a99068a6c49',1,'cv::MatExpr::operator^(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9867b0d5e11c2fef494b71e51d21da1b',1,'cv::MatExpr::operator^(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a15cd0aff27ba61cb2563894b01547e7e',1,'cv::MatExpr::operator^(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac559f4bd48f3660ee56a223258dc6bb9',1,'cv::MatExpr::operator^(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga7c759a9f061d90e4c6dac60aa74fb986',1,'cv::operator^()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f2db1ff7a6beee9d6abb68fca5486',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19bb391512f5ba4c2fee17b49f482269',1,'cv::cudev::operator^(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6996ae50fe4252f163301d6440a5c244',1,'cv::cudev::operator^(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35bf74a15b738d8b54e7bc12bbae0993',1,'cv::cudev::operator^(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae841dcb6dd5dbac738ea6f92c8c68b68',1,'cv::cudev::operator^(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga382357929ae811bbfc4e808b4e3bc8f2',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b81aa937cefb46d9896886aeeaa883c',1,'cv::cudev::operator^(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68a8e460780b94e85614d7785cbd3cb2',1,'cv::cudev::operator^(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7067102ad5f321c066fa7f2db3566b63',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff97ad64d1178cb4f6022f6c046d9e19',1,'cv::cudev::operator^(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae05c59b91c6841b7b4513e54e6de72db',1,'cv::cudev::operator^(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga553a0ab64e059b30e81c8ab8802d1ddf',1,'cv::cudev::operator^(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce073b221be8f03e1af8d35b795efa5',1,'cv::cudev::operator^(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae247dcb0213e92795a12085731f99b49',1,'cv::cudev::operator^(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f61a3af63ded7c934b5859eefd1e108',1,'cv::cudev::operator^(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa347f52f3f818f094c59a9cdf1f18ae8',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fad8e805a97475f06edef6af6bf976c',1,'cv::cudev::operator^(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9546d5b0db6ba30340fb1d19a1428be',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee3dfc9cff4b1d5f64e0351e091d27f',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7221d69a134b0ef5b08e97bb968d0762',1,'cv::cudev::operator^(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68fca21ce958616bb3cce2827c81bcb1',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga219e0d330b1ae4f6c55ef2bc9cd61b54',1,'cv::cudev::operator^(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c7b83d9c2a632dacbcd26a6bc71fcb8',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc55eed4cb6100456719dd7d42ab840',1,'cv::cudev::operator^(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa05edd1f94210980d40ecd8615e6cd',1,'cv::cudev::operator^(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57b0beb61b6838a8997630c88d57b1c0',1,'cv::cudev::operator^(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga574dbf94893fb637932048a1da56f61e',1,'cv::cudev::operator^(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a2d82b647bfdd3d8b9f555255b08446',1,'cv::cudev::operator^(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67b57ea4eeeb2dfc404c0596ad12a003',1,'cv::cudev::operator^(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f084768a0834cb515abe7cc12e5a5c2',1,'cv::cudev::operator^(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga262bbf2d811490645625b3c0819db5a9',1,'cv::cudev::operator^(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9008ea56e80e41f137fae6c4f29c5e2c',1,'cv::cudev::operator^(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b226fe3a602b25eb493c5b47675b115',1,'cv::cudev::operator^(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f177c946e1c5b13bda7e1a4d6b14792',1,'cv::cudev::operator^(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba1a42db310a4daf0fb2865aaf7f5201',1,'cv::cudev::operator^(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb9bef1f86ce4022e33132f5a80b4ae',1,'cv::cudev::operator^(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeaf6f4ae0c4adbf3594389355fc10fc6',1,'cv::cudev::operator^(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6307095b70d98cfb7875659cd516c9d7',1,'cv::cudev::operator^(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga276ef3a39dccd5a558013568f8e10634',1,'cv::cudev::operator^(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b709e4bac601f7322655f2bdb989cae',1,'cv::cudev::operator^(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2081fb9edca3a8318295766946442143',1,'cv::cudev::operator^(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42a42be02e720782ac6d6a890f87df34',1,'cv::cudev::operator^(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf503ce80b70d5e95589c6bcc5dcdc534',1,'cv::cudev::operator^(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86b5ec62d72169a5af71fbef20395bf7',1,'cv::cudev::operator^(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc0fe10ccf8bffd6a42d61a2cb7b7630',1,'cv::cudev::operator^(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29e1fa7243c5a45d5b4a8333ef5e4ad4',1,'cv::cudev::operator^(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace59218cd1224e9bd4e71d44effb706e',1,'cv::cudev::operator^(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb305d044d1d79eaa26884fa8691b13c',1,'cv::cudev::operator^(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92297263151c479220003960e6c94826',1,'cv::cudev::operator^(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23dec7e74c18bf4befb0e357ffada712',1,'cv::cudev::operator^(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc8b1ea1436679399d6de28a93f37c7c',1,'cv::cudev::operator^(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cdbc34390912374b3c016740db6e5a1',1,'cv::cudev::operator^(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga562e145a0cc65fa6571d18d0b5304fcd',1,'cv::cudev::operator^(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1487d3dd6d9e842c3f266fdef9b3cd06',1,'cv::cudev::operator^(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bdf640af5ef6c8037f04d2a21f72624',1,'cv::cudev::operator^(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be79933bce514a940a915865400b1be',1,'cv::cudev::operator^(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa8c7b4fcf0364baf63899bab7585b4',1,'cv::cudev::operator^(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c856e8c20c27045d1016b675fea6c29',1,'cv::cudev::operator^(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a4d4f19b1228d8c35964c9631b12db1',1,'cv::cudev::operator^(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc9f85f2cd8647cac819333b0b5d90d2',1,'cv::cudev::operator^(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed751d867269bace54872e57a083af43',1,'cv::cudev::operator^(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9d23aba1973ca8fd1ea7c710c89d9c9',1,'cv::cudev::operator^(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a5b7d75125123f6c481b6b5335baf5',1,'cv::cudev::operator^(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1860e2d6fbcabfd958136c1d2a873565',1,'cv::cudev::operator^(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7064aa0e201b06e6456b7225ab13b76f',1,'cv::cudev::operator^(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182950bf07b543f15aef63a570a75740',1,'cv::cudev::operator^(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7cb4644f2a37866175abd213e99bf9c',1,'cv::cudev::operator^(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga106351f7f67aac5a4539cf2da429051b',1,'cv::cudev::operator^(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5c2aa1114fc5bc919fecf84836a85bb',1,'cv::cudev::operator^(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e81b5c59f5873a9b2b355605d4628c4',1,'cv::cudev::operator^(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24aac76e0a255dbf62c78f3f5ac1b4d6',1,'cv::cudev::operator^(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7de7a8c28d3b5cc29651d6128ca2d910',1,'cv::cudev::operator^(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f1c529d765c81d140c77108626aa14a',1,'cv::cudev::operator^(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef0821f6c671d9712c7238465f8d4884',1,'cv::cudev::operator^(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2daad5e0b4930181e2e66c9f17f93c20',1,'cv::cudev::operator^(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ff5a2a334e85c74b8286600064aae8b',1,'cv::cudev::operator^(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63ccaabd5ee595473b9dc5bd77d9948e',1,'cv::cudev::operator^(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab653e7053862a95e577b8db3322dd49c',1,'cv::cudev::operator^(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6976070c4b0ebc9d2ac34bc7c325b112',1,'cv::cudev::operator^(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147cb8d515df77bc9dda9bd957c21a75',1,'cv::cudev::operator^(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8caa79576d2640d9c571dcbf39c41f9e',1,'cv::cudev::operator^(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga536c9c60a5f68e761b71f7a521bd440f',1,'cv::cudev::operator^(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga309e3255d388c6334fa4baccb66c39c4',1,'cv::cudev::operator^(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga844cecceba28036b2ef12a014b0ccfb7',1,'cv::cudev::operator^(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga930dfc19c86c269dba903a06651d79b1',1,'cv::cudev::operator^(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc31b023630642daa958687ede735dc',1,'cv::cudev::operator^(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga260712aebe5466a8e4f01ea498d2ca02',1,'cv::cudev::operator^(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09aac80f9054e642a162795b850c973b',1,'cv::cudev::operator^(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056a095b396077c1a14f6e237ba69f62',1,'cv::cudev::operator^(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4424230c30d8785f0c7ecb0903651540',1,'cv::cudev::operator^(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b85716ad8e68247c20bbf301d5db78b',1,'cv::cudev::operator^(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61455fe5de691c1102ebec11128de52a',1,'cv::cudev::operator^(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga754806ed446290afea054d4cab646e54',1,'cv::cudev::operator^(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd6445fdc04ff5606d05f981dac957ee',1,'cv::cudev::operator^(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3903754f858daaf6174edeec6c964db1',1,'cv::cudev::operator^(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ae473eb2417fa915fb5d169be28d0d6',1,'cv::cudev::operator^(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga7c759a9f061d90e4c6dac60aa74fb986',1,'operator^(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f2db1ff7a6beee9d6abb68fca5486',1,'operator^(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19bb391512f5ba4c2fee17b49f482269',1,'operator^(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6996ae50fe4252f163301d6440a5c244',1,'operator^(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35bf74a15b738d8b54e7bc12bbae0993',1,'operator^(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae841dcb6dd5dbac738ea6f92c8c68b68',1,'operator^(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga382357929ae811bbfc4e808b4e3bc8f2',1,'operator^(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b81aa937cefb46d9896886aeeaa883c',1,'operator^(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68a8e460780b94e85614d7785cbd3cb2',1,'operator^(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7067102ad5f321c066fa7f2db3566b63',1,'operator^(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff97ad64d1178cb4f6022f6c046d9e19',1,'operator^(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae05c59b91c6841b7b4513e54e6de72db',1,'operator^(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga553a0ab64e059b30e81c8ab8802d1ddf',1,'operator^(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce073b221be8f03e1af8d35b795efa5',1,'operator^(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae247dcb0213e92795a12085731f99b49',1,'operator^(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f61a3af63ded7c934b5859eefd1e108',1,'operator^(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa347f52f3f818f094c59a9cdf1f18ae8',1,'operator^(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fad8e805a97475f06edef6af6bf976c',1,'operator^(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9546d5b0db6ba30340fb1d19a1428be',1,'operator^(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee3dfc9cff4b1d5f64e0351e091d27f',1,'operator^(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7221d69a134b0ef5b08e97bb968d0762',1,'operator^(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68fca21ce958616bb3cce2827c81bcb1',1,'operator^(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga219e0d330b1ae4f6c55ef2bc9cd61b54',1,'operator^(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c7b83d9c2a632dacbcd26a6bc71fcb8',1,'operator^(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc55eed4cb6100456719dd7d42ab840',1,'operator^(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa05edd1f94210980d40ecd8615e6cd',1,'operator^(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57b0beb61b6838a8997630c88d57b1c0',1,'operator^(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga574dbf94893fb637932048a1da56f61e',1,'operator^(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a2d82b647bfdd3d8b9f555255b08446',1,'operator^(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67b57ea4eeeb2dfc404c0596ad12a003',1,'operator^(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f084768a0834cb515abe7cc12e5a5c2',1,'operator^(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga262bbf2d811490645625b3c0819db5a9',1,'operator^(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9008ea56e80e41f137fae6c4f29c5e2c',1,'operator^(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b226fe3a602b25eb493c5b47675b115',1,'operator^(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f177c946e1c5b13bda7e1a4d6b14792',1,'operator^(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba1a42db310a4daf0fb2865aaf7f5201',1,'operator^(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb9bef1f86ce4022e33132f5a80b4ae',1,'operator^(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeaf6f4ae0c4adbf3594389355fc10fc6',1,'operator^(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6307095b70d98cfb7875659cd516c9d7',1,'operator^(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga276ef3a39dccd5a558013568f8e10634',1,'operator^(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b709e4bac601f7322655f2bdb989cae',1,'operator^(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2081fb9edca3a8318295766946442143',1,'operator^(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42a42be02e720782ac6d6a890f87df34',1,'operator^(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf503ce80b70d5e95589c6bcc5dcdc534',1,'operator^(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86b5ec62d72169a5af71fbef20395bf7',1,'operator^(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc0fe10ccf8bffd6a42d61a2cb7b7630',1,'operator^(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29e1fa7243c5a45d5b4a8333ef5e4ad4',1,'operator^(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace59218cd1224e9bd4e71d44effb706e',1,'operator^(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb305d044d1d79eaa26884fa8691b13c',1,'operator^(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92297263151c479220003960e6c94826',1,'operator^(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23dec7e74c18bf4befb0e357ffada712',1,'operator^(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc8b1ea1436679399d6de28a93f37c7c',1,'operator^(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cdbc34390912374b3c016740db6e5a1',1,'operator^(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga562e145a0cc65fa6571d18d0b5304fcd',1,'operator^(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1487d3dd6d9e842c3f266fdef9b3cd06',1,'operator^(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bdf640af5ef6c8037f04d2a21f72624',1,'operator^(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be79933bce514a940a915865400b1be',1,'operator^(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa8c7b4fcf0364baf63899bab7585b4',1,'operator^(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c856e8c20c27045d1016b675fea6c29',1,'operator^(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a4d4f19b1228d8c35964c9631b12db1',1,'operator^(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc9f85f2cd8647cac819333b0b5d90d2',1,'operator^(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed751d867269bace54872e57a083af43',1,'operator^(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9d23aba1973ca8fd1ea7c710c89d9c9',1,'operator^(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a5b7d75125123f6c481b6b5335baf5',1,'operator^(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1860e2d6fbcabfd958136c1d2a873565',1,'operator^(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7064aa0e201b06e6456b7225ab13b76f',1,'operator^(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182950bf07b543f15aef63a570a75740',1,'operator^(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7cb4644f2a37866175abd213e99bf9c',1,'operator^(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga106351f7f67aac5a4539cf2da429051b',1,'operator^(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5c2aa1114fc5bc919fecf84836a85bb',1,'operator^(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e81b5c59f5873a9b2b355605d4628c4',1,'operator^(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24aac76e0a255dbf62c78f3f5ac1b4d6',1,'operator^(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7de7a8c28d3b5cc29651d6128ca2d910',1,'operator^(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f1c529d765c81d140c77108626aa14a',1,'operator^(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef0821f6c671d9712c7238465f8d4884',1,'operator^(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2daad5e0b4930181e2e66c9f17f93c20',1,'operator^(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ff5a2a334e85c74b8286600064aae8b',1,'operator^(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63ccaabd5ee595473b9dc5bd77d9948e',1,'operator^(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab653e7053862a95e577b8db3322dd49c',1,'operator^(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6976070c4b0ebc9d2ac34bc7c325b112',1,'operator^(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147cb8d515df77bc9dda9bd957c21a75',1,'operator^(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8caa79576d2640d9c571dcbf39c41f9e',1,'operator^(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga536c9c60a5f68e761b71f7a521bd440f',1,'operator^(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga309e3255d388c6334fa4baccb66c39c4',1,'operator^(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga844cecceba28036b2ef12a014b0ccfb7',1,'operator^(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga930dfc19c86c269dba903a06651d79b1',1,'operator^(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc31b023630642daa958687ede735dc',1,'operator^(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga260712aebe5466a8e4f01ea498d2ca02',1,'operator^(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09aac80f9054e642a162795b850c973b',1,'operator^(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056a095b396077c1a14f6e237ba69f62',1,'operator^(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4424230c30d8785f0c7ecb0903651540',1,'operator^(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b85716ad8e68247c20bbf301d5db78b',1,'operator^(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61455fe5de691c1102ebec11128de52a',1,'operator^(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga754806ed446290afea054d4cab646e54',1,'operator^(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd6445fdc04ff5606d05f981dac957ee',1,'operator^(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3903754f858daaf6174edeec6c964db1',1,'operator^(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ae473eb2417fa915fb5d169be28d0d6',1,'operator^(uint s, const uint4 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0eec0ec1834b05e931022533e2ae4d03',1,'std::operator^()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a99429d2419718d6f9cf98153cb104a57',1,'std::regex_constants::operator^(syntax_option_type __a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ac6b912c67d2cdd494a770cd23c1b4f98',1,'std::regex_constants::operator^(match_flag_type __a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga7c9b5309fab61ddf049e350fdaa599fe',1,'std::tr2::operator^()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga7c9b5309fab61ddf049e350fdaa599fe',1,'operator^()(Global Namespace)']]], - ['operator_5e_3d_348',['operator^=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa9ac8697d02b2a3bacc58b1fa619b630',1,'std::bitset::operator^=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa9ac8697d02b2a3bacc58b1fa619b630',1,'std::bitset::operator^=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa45daae152fd32ab851c56779fc1e13c',1,'std::gslice_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga335663b1692606f8a5d96324592d4785',1,'std::indirect_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab7b73360db81555ebc04e3c482a94857',1,'std::mask_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga262449de3e39bbae18ab3bb911b2eb8b',1,'std::slice_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#adf5d449d2357108981b85b43f05114e7',1,'std::tr2::dynamic_bitset::operator^=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#adf5d449d2357108981b85b43f05114e7',1,'std::tr2::dynamic_bitset::operator^=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga12372c525f0ae4cdeb7180c7337b57ed',1,'std::valarray::operator^=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga945c098affa36e4df42895bca9937b61',1,'std::valarray::operator^=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga12372c525f0ae4cdeb7180c7337b57ed',1,'valarray< size_t >::operator^=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga945c098affa36e4df42895bca9937b61',1,'valarray< size_t >::operator^=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gadd58fb6b2720ce0e68d9665ddee198f9',1,'cv::operator^=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gadd58fb6b2720ce0e68d9665ddee198f9',1,'operator^=()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a782f3bd1b71adf5bc9f337b74ccb169d',1,'std::regex_constants::operator^=(syntax_option_type &__a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a6edeffe99c8db99f7d365da413e65c34',1,'std::regex_constants::operator^=(match_flag_type &__a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa45daae152fd32ab851c56779fc1e13c',1,'operator^=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga12372c525f0ae4cdeb7180c7337b57ed',1,'operator^=(const _Tp &)(Global Namespace)']]], - ['operatorinversesqrt_349',['operatorInverseSqrt',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#ae4b13fe4ce22faf74e50d346fc51a66e',1,'Eigen::SelfAdjointEigenSolver']]], - ['operatornorm_350',['operatorNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ff9bc0b9bea2d0822a2bf3192783102',1,'Eigen::MatrixBase::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ff9bc0b9bea2d0822a2bf3192783102',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ff9bc0b9bea2d0822a2bf3192783102',1,'MatrixBase< Solve< Decomposition, RhsType > >::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a12a7da482e31ec9c517dca92dd7bae61',1,'Eigen::SelfAdjointView::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a12a7da482e31ec9c517dca92dd7bae61',1,'SelfAdjointView< const Derived, UpLo >::operatorNorm()']]], - ['operators_2ehpp_351',['operators.hpp',['https://docs.opencv.org/4.2.0/dd/dcd/operators_8hpp.html',1,'']]], - ['operatorsqrt_352',['operatorSqrt',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#aeeedb2ae618f21a4eb59465746c1cee5',1,'Eigen::SelfAdjointEigenSolver']]], - ['operator_7c_353',['operator|',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8938333ac6cc65c2cc4a21071b22df56',1,'cv::MatExpr::operator|(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aeac05ffd3d5c1d6c803e46a5ed380a95',1,'cv::MatExpr::operator|(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27c1238f43dfbf691c3da8b9bcbe8622',1,'cv::MatExpr::operator|(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acaa29c7d0f130d120737fcb3c5dac54d',1,'cv::MatExpr::operator|(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aab1250c235649a10a478a88394b23fda',1,'cv::MatExpr::operator|(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8938333ac6cc65c2cc4a21071b22df56',1,'cv::MatExpr::operator|(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aeac05ffd3d5c1d6c803e46a5ed380a95',1,'cv::MatExpr::operator|(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27c1238f43dfbf691c3da8b9bcbe8622',1,'cv::MatExpr::operator|(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acaa29c7d0f130d120737fcb3c5dac54d',1,'cv::MatExpr::operator|(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aab1250c235649a10a478a88394b23fda',1,'cv::MatExpr::operator|(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga08e30fb25ccd0e148c11eab8f9b0daaf',1,'cv::operator|()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72373b516825ad78e4c3db1918858a03',1,'cv::cudev::operator|(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6817a3e829bea52da01ea49c16839597',1,'cv::cudev::operator|(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b61ec46777577e1395990626361d82',1,'cv::cudev::operator|(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e5ac5a0d8c733bee304065ea5d10c5c',1,'cv::cudev::operator|(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb491ada5fa699f281393e20bad19c59',1,'cv::cudev::operator|(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga140d231543d1ec29d211aa7b6aae1f9e',1,'cv::cudev::operator|(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeec118fb2a44a56ccc4242809ef2ee45',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8765a933b0b5adf61c098fbf191a8f69',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga494eb039f25f4b355015e048e65ae92a',1,'cv::cudev::operator|(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67f56e5f79c0c5a8d35924a320e8035',1,'cv::cudev::operator|(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7e1dd96697340c2af8b08e71f65f058',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga214e51557127c9dbf5822af3b7e4086f',1,'cv::cudev::operator|(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbf444dd7ea65e673b383fdc24b7b9bc',1,'cv::cudev::operator|(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71bf7e7b2a0722518d460c2ef26bd009',1,'cv::cudev::operator|(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4c0138f513cd7e6f2ec5c673baa9430',1,'cv::cudev::operator|(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630597efc5d5a29f689f5f73b6cc2057',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79dea7d19820e4a739fb7927daff522f',1,'cv::cudev::operator|(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a62899f4dfb4a4a51fc9e18ced6b236',1,'cv::cudev::operator|(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ebd78b7e25610fdca444e53b9124af1',1,'cv::cudev::operator|(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga619519d7e0cbc71f88dcf10af8bdc3e4',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad952cc55d6204ec9648e8e226307f433',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99e794f6c32bf7a1e18e28e5cd76b3f0',1,'cv::cudev::operator|(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6285d927a8d75294be444e2923d4015d',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddeb8331934690f04aca52ec3d485468',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eae7ed305c1f6f0d697cf6b5513b52c',1,'cv::cudev::operator|(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48ef824b54938a4efab1d92d2547b6ff',1,'cv::cudev::operator|(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b91ed6a653874c97911addea7492e88',1,'cv::cudev::operator|(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a7ba688aec7b3bc93dfd03efb7a0a1',1,'cv::cudev::operator|(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0df3c76006f995c76b73f820597058d3',1,'cv::cudev::operator|(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33dc3b6cc908d682b8b4b924037462a8',1,'cv::cudev::operator|(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa67b59a7a6af82dad9017aeb8a9af3',1,'cv::cudev::operator|(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3471e18d63b852c4eb063e1ccf2a9d1',1,'cv::cudev::operator|(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e682a0014ba8daf79be5ea7b234da6f',1,'cv::cudev::operator|(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6cb1874e00d5f309b08b23fa3135867',1,'cv::cudev::operator|(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e888e4f12d42f958c274ae74b5b8fcf',1,'cv::cudev::operator|(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga926b508cb3586f7e8b26e7ab4f3a36d9',1,'cv::cudev::operator|(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga347152b541965b0706b8883c77ab59d1',1,'cv::cudev::operator|(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b428f7caf6c47e78c4ee870da69a5bb',1,'cv::cudev::operator|(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f6ed6bde6e724a15b3d462ad5fff304',1,'cv::cudev::operator|(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755c6b9eed56b86c14c166120150cf5a',1,'cv::cudev::operator|(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ac29af04d3ff28282099ae43d64c1eb',1,'cv::cudev::operator|(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5168caae872a1693252bf524ca06a971',1,'cv::cudev::operator|(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b04c7e2bf05018eff5107b8b21d834f',1,'cv::cudev::operator|(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fa19097be382eb043bc1947c99527bf',1,'cv::cudev::operator|(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dc4e4e7647a0a14bfaf036a293f7c20',1,'cv::cudev::operator|(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c4229c9c4d01aae2eb3c68b6d295a5d',1,'cv::cudev::operator|(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga089d5fc24f8caba2cd4157d4c72acd16',1,'cv::cudev::operator|(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4df0525a2ea1daa49391935fd6096f82',1,'cv::cudev::operator|(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a144b52934da855d744f0f6821ad443',1,'cv::cudev::operator|(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41753a5acd49f58734c7f0b2b906c820',1,'cv::cudev::operator|(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga066869163b1bdbd4100bdc23a675e905',1,'cv::cudev::operator|(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0631c1ac1e1d609ce0a5a20bc12d61a5',1,'cv::cudev::operator|(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64863e5f445a3cb5b5f5900dbb2d1cb6',1,'cv::cudev::operator|(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga843f54b435b967d9fcb1259ebe47d149',1,'cv::cudev::operator|(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4f44f5d07e21c6d6e891fe50f7a95c3',1,'cv::cudev::operator|(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e22900c73b91968a336722095dee82f',1,'cv::cudev::operator|(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19056ea37b866c0f7f7e47b9d1d06c56',1,'cv::cudev::operator|(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga153845e401bd20e6df63bedfaf7d7740',1,'cv::cudev::operator|(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efc7c5881e23be48037958261a0496f',1,'cv::cudev::operator|(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85a70d4dfeb3063b32cbe3db7f75cb8a',1,'cv::cudev::operator|(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga305080aaf14a3ac0997ad739d57372c7',1,'cv::cudev::operator|(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a0a8103dfd6807e20fcd226e5cd3aec',1,'cv::cudev::operator|(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14769e6c0a5b2888af00d0ceb63fc090',1,'cv::cudev::operator|(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b29a922cca4534da997e1800dbccc0f',1,'cv::cudev::operator|(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1cc5655efe72e5d9e95279d76e1d48e',1,'cv::cudev::operator|(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd8cbff79c1cace2db279f6de7a0681',1,'cv::cudev::operator|(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac38b34c8a76b66b0466166192db5d2e6',1,'cv::cudev::operator|(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236fa0260af6ef2b14fadba155fe5abe',1,'cv::cudev::operator|(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37dad1dbb748b11a1193be946b3722a1',1,'cv::cudev::operator|(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9803d4b0e3d1a0167830a72715b0c04e',1,'cv::cudev::operator|(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77b5075254d12609ad87bed4527633a4',1,'cv::cudev::operator|(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf719b791735f78195bfe29926f1b0ab7',1,'cv::cudev::operator|(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3689763321a43eacdd8d773eb2c70712',1,'cv::cudev::operator|(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572df6ef6d0112b56753ba4014881e53',1,'cv::cudev::operator|(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6457d3d1d93c0166976483a2f951ee3d',1,'cv::cudev::operator|(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91b74f2c70bcedc67c9df84a02addb79',1,'cv::cudev::operator|(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a47b495c6be9943d7cd3a7f7fd616f',1,'cv::cudev::operator|(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab07096b3294af7bcec98722b2446e479',1,'cv::cudev::operator|(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ed7b2138bc1f9497aa3c07b3dd5a07f',1,'cv::cudev::operator|(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaace76c0789620825414ff7a595ef5911',1,'cv::cudev::operator|(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6a261516077c0b79a742b166cfc07a0',1,'cv::cudev::operator|(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16512210aee4858a3ab481592bf74f1c',1,'cv::cudev::operator|(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2438bf2b14756d6e5ed3bad3b3c1e1ec',1,'cv::cudev::operator|(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ae3b6aa8f01802bd73dc969d72fabc5',1,'cv::cudev::operator|(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ead05d032040865f64cd3f8f1e0547',1,'cv::cudev::operator|(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62e550301aa3c7d81e282e7b5eb3020a',1,'cv::cudev::operator|(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac167061f4c1ca73369f88716e8989984',1,'cv::cudev::operator|(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafe49b72410fc249acf6ec30c4af1de5',1,'cv::cudev::operator|(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0385791a7e492043910a3c6d9633f1e',1,'cv::cudev::operator|(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f53c51e5f229c2d88d5820a0c1bf963',1,'cv::cudev::operator|(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef6dcabe2a6d79eb4f75768d54ddb701',1,'cv::cudev::operator|(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ccfb5c0cc94544213a31f2cca13c615',1,'cv::cudev::operator|(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32e508cfe66f331a33b2f3da6e900404',1,'cv::cudev::operator|(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga085e8a5af5cec776858566322bde16fe',1,'cv::cudev::operator|(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3050373d10dc996186ca8f35ae0d0bf',1,'cv::cudev::operator|(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24144ec0fb8b6b445ab0a1ee9e41da15',1,'cv::cudev::operator|(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga08e30fb25ccd0e148c11eab8f9b0daaf',1,'operator|(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72373b516825ad78e4c3db1918858a03',1,'operator|(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6817a3e829bea52da01ea49c16839597',1,'operator|(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b61ec46777577e1395990626361d82',1,'operator|(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e5ac5a0d8c733bee304065ea5d10c5c',1,'operator|(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb491ada5fa699f281393e20bad19c59',1,'operator|(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga140d231543d1ec29d211aa7b6aae1f9e',1,'operator|(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeec118fb2a44a56ccc4242809ef2ee45',1,'operator|(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8765a933b0b5adf61c098fbf191a8f69',1,'operator|(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga494eb039f25f4b355015e048e65ae92a',1,'operator|(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67f56e5f79c0c5a8d35924a320e8035',1,'operator|(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7e1dd96697340c2af8b08e71f65f058',1,'operator|(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga214e51557127c9dbf5822af3b7e4086f',1,'operator|(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbf444dd7ea65e673b383fdc24b7b9bc',1,'operator|(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71bf7e7b2a0722518d460c2ef26bd009',1,'operator|(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4c0138f513cd7e6f2ec5c673baa9430',1,'operator|(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630597efc5d5a29f689f5f73b6cc2057',1,'operator|(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79dea7d19820e4a739fb7927daff522f',1,'operator|(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a62899f4dfb4a4a51fc9e18ced6b236',1,'operator|(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ebd78b7e25610fdca444e53b9124af1',1,'operator|(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga619519d7e0cbc71f88dcf10af8bdc3e4',1,'operator|(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad952cc55d6204ec9648e8e226307f433',1,'operator|(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99e794f6c32bf7a1e18e28e5cd76b3f0',1,'operator|(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6285d927a8d75294be444e2923d4015d',1,'operator|(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddeb8331934690f04aca52ec3d485468',1,'operator|(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eae7ed305c1f6f0d697cf6b5513b52c',1,'operator|(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48ef824b54938a4efab1d92d2547b6ff',1,'operator|(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b91ed6a653874c97911addea7492e88',1,'operator|(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a7ba688aec7b3bc93dfd03efb7a0a1',1,'operator|(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0df3c76006f995c76b73f820597058d3',1,'operator|(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33dc3b6cc908d682b8b4b924037462a8',1,'operator|(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa67b59a7a6af82dad9017aeb8a9af3',1,'operator|(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3471e18d63b852c4eb063e1ccf2a9d1',1,'operator|(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e682a0014ba8daf79be5ea7b234da6f',1,'operator|(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6cb1874e00d5f309b08b23fa3135867',1,'operator|(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e888e4f12d42f958c274ae74b5b8fcf',1,'operator|(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga926b508cb3586f7e8b26e7ab4f3a36d9',1,'operator|(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga347152b541965b0706b8883c77ab59d1',1,'operator|(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b428f7caf6c47e78c4ee870da69a5bb',1,'operator|(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f6ed6bde6e724a15b3d462ad5fff304',1,'operator|(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755c6b9eed56b86c14c166120150cf5a',1,'operator|(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ac29af04d3ff28282099ae43d64c1eb',1,'operator|(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5168caae872a1693252bf524ca06a971',1,'operator|(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b04c7e2bf05018eff5107b8b21d834f',1,'operator|(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fa19097be382eb043bc1947c99527bf',1,'operator|(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dc4e4e7647a0a14bfaf036a293f7c20',1,'operator|(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c4229c9c4d01aae2eb3c68b6d295a5d',1,'operator|(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga089d5fc24f8caba2cd4157d4c72acd16',1,'operator|(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4df0525a2ea1daa49391935fd6096f82',1,'operator|(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a144b52934da855d744f0f6821ad443',1,'operator|(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41753a5acd49f58734c7f0b2b906c820',1,'operator|(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga066869163b1bdbd4100bdc23a675e905',1,'operator|(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0631c1ac1e1d609ce0a5a20bc12d61a5',1,'operator|(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64863e5f445a3cb5b5f5900dbb2d1cb6',1,'operator|(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga843f54b435b967d9fcb1259ebe47d149',1,'operator|(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4f44f5d07e21c6d6e891fe50f7a95c3',1,'operator|(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e22900c73b91968a336722095dee82f',1,'operator|(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19056ea37b866c0f7f7e47b9d1d06c56',1,'operator|(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga153845e401bd20e6df63bedfaf7d7740',1,'operator|(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efc7c5881e23be48037958261a0496f',1,'operator|(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85a70d4dfeb3063b32cbe3db7f75cb8a',1,'operator|(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga305080aaf14a3ac0997ad739d57372c7',1,'operator|(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a0a8103dfd6807e20fcd226e5cd3aec',1,'operator|(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14769e6c0a5b2888af00d0ceb63fc090',1,'operator|(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b29a922cca4534da997e1800dbccc0f',1,'operator|(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1cc5655efe72e5d9e95279d76e1d48e',1,'operator|(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd8cbff79c1cace2db279f6de7a0681',1,'operator|(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac38b34c8a76b66b0466166192db5d2e6',1,'operator|(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236fa0260af6ef2b14fadba155fe5abe',1,'operator|(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37dad1dbb748b11a1193be946b3722a1',1,'operator|(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9803d4b0e3d1a0167830a72715b0c04e',1,'operator|(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77b5075254d12609ad87bed4527633a4',1,'operator|(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf719b791735f78195bfe29926f1b0ab7',1,'operator|(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3689763321a43eacdd8d773eb2c70712',1,'operator|(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572df6ef6d0112b56753ba4014881e53',1,'operator|(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6457d3d1d93c0166976483a2f951ee3d',1,'operator|(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91b74f2c70bcedc67c9df84a02addb79',1,'operator|(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a47b495c6be9943d7cd3a7f7fd616f',1,'operator|(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab07096b3294af7bcec98722b2446e479',1,'operator|(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ed7b2138bc1f9497aa3c07b3dd5a07f',1,'operator|(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaace76c0789620825414ff7a595ef5911',1,'operator|(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6a261516077c0b79a742b166cfc07a0',1,'operator|(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16512210aee4858a3ab481592bf74f1c',1,'operator|(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2438bf2b14756d6e5ed3bad3b3c1e1ec',1,'operator|(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ae3b6aa8f01802bd73dc969d72fabc5',1,'operator|(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ead05d032040865f64cd3f8f1e0547',1,'operator|(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62e550301aa3c7d81e282e7b5eb3020a',1,'operator|(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac167061f4c1ca73369f88716e8989984',1,'operator|(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafe49b72410fc249acf6ec30c4af1de5',1,'operator|(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0385791a7e492043910a3c6d9633f1e',1,'operator|(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f53c51e5f229c2d88d5820a0c1bf963',1,'operator|(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef6dcabe2a6d79eb4f75768d54ddb701',1,'operator|(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ccfb5c0cc94544213a31f2cca13c615',1,'operator|(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32e508cfe66f331a33b2f3da6e900404',1,'operator|(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga085e8a5af5cec776858566322bde16fe',1,'operator|(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3050373d10dc996186ca8f35ae0d0bf',1,'operator|(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24144ec0fb8b6b445ab0a1ee9e41da15',1,'operator|(const uint3 &a, uint s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a37b7f9acb3d4f471410857a524425f03',1,'std::operator|()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#aed34b3d93916973cfea2af94c22ac505',1,'std::regex_constants::operator|(syntax_option_type __a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a510d0810f0fe55a65a1f3ad142e95e2c',1,'std::regex_constants::operator|(match_flag_type __a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gad20c154d9a0dc8523781b0d2fe0d3de1',1,'std::tr2::operator|()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gad20c154d9a0dc8523781b0d2fe0d3de1',1,'operator|()(Global Namespace)']]], - ['operator_7c_3d_354',['operator|=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a75853927c9ad1aa9548e9eea7fde188c',1,'std::bitset::operator|=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a75853927c9ad1aa9548e9eea7fde188c',1,'std::bitset::operator|=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga87a6054e3d3df9b3b828c86d7b71a7d0',1,'std::gslice_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga349500cff6b300c39a505e9c74943b86',1,'std::indirect_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga684708f251addb2566756f4d2eedee36',1,'std::mask_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0cfe83bfd0c60d5f1b393bbddcc70889',1,'std::slice_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a4db104deaf30025db9b8064f29fa29f8',1,'std::tr2::dynamic_bitset::operator|=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a4db104deaf30025db9b8064f29fa29f8',1,'std::tr2::dynamic_bitset::operator|=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf20cc6bf249d338dd1fdb26f4363ee2e',1,'std::valarray::operator|=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2082939513c0702ce488c2dc27e98951',1,'std::valarray::operator|=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf20cc6bf249d338dd1fdb26f4363ee2e',1,'valarray< size_t >::operator|=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2082939513c0702ce488c2dc27e98951',1,'valarray< size_t >::operator|=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaad93bb02fc5c3c4c248b1dbb8a7348fe',1,'cv::operator|=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaad93bb02fc5c3c4c248b1dbb8a7348fe',1,'operator|=()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a4bd5dcfb1f0eead5b8f66233f45638f4',1,'std::regex_constants::operator|=(syntax_option_type &__a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a1cc70d79ada227928c10a6ae955a5527',1,'std::regex_constants::operator|=(match_flag_type &__a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga87a6054e3d3df9b3b828c86d7b71a7d0',1,'operator|=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf20cc6bf249d338dd1fdb26f4363ee2e',1,'operator|=(const _Tp &)(Global Namespace)']]], - ['operator_7c_7c_355',['operator||',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade405ae7fba00188385f79da087b473d',1,'cv::cudev::operator||(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67336d4da1a1a0e097576e110e322d17',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d9325273f75ec46a5d0ccaa698dcab2',1,'cv::cudev::operator||(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a350991d905802482a4a52516296256',1,'cv::cudev::operator||(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd38e92dca97e14285cb0a994eac2eb2',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1cf8719bfe35c1ce58b69439440ebb',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga407966ca821a5b21a0fa3669273ce155',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3f1b3a6297712114fb1528180bf4d5d',1,'cv::cudev::operator||(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa60211ccc7148f580c9213f98d57d852',1,'cv::cudev::operator||(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc492c09a30238356c29f992f434bbb',1,'cv::cudev::operator||(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab229fbb04aea1adaf4ad5a99495035b9',1,'cv::cudev::operator||(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac068c500d749dcf1c1b633a71343bf64',1,'cv::cudev::operator||(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfceb475fab9bf020cc18a7d00ce68fa',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga970bfbba082e36b082ec64f178fa4bc4',1,'cv::cudev::operator||(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451cabb9165a8cb76c8b8281a48a74c3',1,'cv::cudev::operator||(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ed51988f3b066b935628ca0ca76c806',1,'cv::cudev::operator||(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56be341fd82bc471dc3727ac767df94d',1,'cv::cudev::operator||(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43139046dc0327bc12a3405a63c93e78',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga759c70e663c4ff4e8d2ae8217d47a7d7',1,'cv::cudev::operator||(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64af392441e02098f668b91b581d6158',1,'cv::cudev::operator||(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9dfe768a49878db05bdb91ebe5a8759b',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga292fb2e70406a170f98347e3d2110db8',1,'cv::cudev::operator||(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20d93bcf778f16d1853957cc42ff9eab',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce18a713dc4adf2e6fc8841b69a7639',1,'cv::cudev::operator||(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf45510b81f8e1759112cecd4b5a4aa3',1,'cv::cudev::operator||(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fe1c8b48957c39413aac5e3ffd90376',1,'cv::cudev::operator||(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b56bd1f805e2cc2a433d784ea26764b',1,'cv::cudev::operator||(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51f6411482c1c1dc459307997d262caa',1,'cv::cudev::operator||(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae01ca019d7b9f4b726b7017dccfb97eb',1,'cv::cudev::operator||(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c9b224b12822bc42b33d5371cf7cef4',1,'cv::cudev::operator||(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdb8f03f5e8aded2d1c1f5b674f8d0be',1,'cv::cudev::operator||(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga682b9e8e6d24725fbfd14afe04c746cc',1,'cv::cudev::operator||(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f2c04274bc2e9ef0c0e64e835272570',1,'cv::cudev::operator||(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9613bf79ecb44e0124d987c0dc603c0e',1,'cv::cudev::operator||(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96c371efcc9fa6314c3997cabac8de8e',1,'cv::cudev::operator||(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebbcb4c326b4d6504cd9400ac933f53e',1,'cv::cudev::operator||(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6a798890ec4e1c957610419cbc07fa3',1,'cv::cudev::operator||(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0637cf031452de7f45462f4cf7d20f0',1,'cv::cudev::operator||(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3532b09926ae239bbfdcb638f8602895',1,'cv::cudev::operator||(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga625848bfaa38a86a0132a1771535fddb',1,'cv::cudev::operator||(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c08c399ce28a20e5849c10236e3ec1e',1,'cv::cudev::operator||(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga446ac73d6fc9c701bf235f9530e05486',1,'cv::cudev::operator||(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bdb1e714d4966bc3b89850c3f223aa6',1,'cv::cudev::operator||(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d607a72c6d5edbf0c5f0defadeecfe9',1,'cv::cudev::operator||(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc57b8d10acf24138375fc21e1799aeb',1,'cv::cudev::operator||(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b65fb035d930940ab0736ddbc0519fc',1,'cv::cudev::operator||(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1593e87e954982987925c25988dab81a',1,'cv::cudev::operator||(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0b4e24f07cae0bd5ef2032f1895b44',1,'cv::cudev::operator||(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb0588dab343533c00fe007f4e019f29',1,'cv::cudev::operator||(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7db7c5c12deeb79a3ad18e230fd0028',1,'cv::cudev::operator||(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99d4f17ca75885550288386f0959cfa5',1,'cv::cudev::operator||(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56bd222aa931f4a2f6c330e6e49ed71c',1,'cv::cudev::operator||(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53fea0cb9bdf3c6ad83ef37fe04f24dc',1,'cv::cudev::operator||(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c523f9819c7a99755990d8ed6b08504',1,'cv::cudev::operator||(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga093ad1e54e64a7cccf3782b2410172e3',1,'cv::cudev::operator||(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3bb180e11c140a1860d1c7282f3f4c5',1,'cv::cudev::operator||(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcd6bed19993a3dec96454714e056e3c',1,'cv::cudev::operator||(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8d59bf11b4243a05cd6cc3456fa3278',1,'cv::cudev::operator||(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga035765656c86485e88a7ffeedff10886',1,'cv::cudev::operator||(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c72b384daef54b49c99c95bb6e5d236',1,'cv::cudev::operator||(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac790b4177372769ebcb41bf113cc07d8',1,'cv::cudev::operator||(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444bdacd77a60792457a032271d6d8cc',1,'cv::cudev::operator||(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41de5b9e5a723be85cb439a1c08f7ce9',1,'cv::cudev::operator||(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5f81c65260b22ae9af48906f448382',1,'cv::cudev::operator||(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28d8dab796f6cc5d9efbba9a4a140d4',1,'cv::cudev::operator||(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32f816f6e9ef55e8af7d1076b934d769',1,'cv::cudev::operator||(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae58e21e5c4f719ccbeff08445d7c6fdc',1,'cv::cudev::operator||(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57922b91c42d3f3ec0d95961bb252c2a',1,'cv::cudev::operator||(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bd2ec7511fa65af12e0c31e7eca6cf1',1,'cv::cudev::operator||(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad435bf12fa84bd6238bd536719b8a55d',1,'cv::cudev::operator||(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace641577e19ea3b0204727ec67a54b77',1,'cv::cudev::operator||(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3ed13bdecfdf8509917b6128cbdd7b',1,'cv::cudev::operator||(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a42dd360c68ec429b3a9abd29792217',1,'cv::cudev::operator||(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62831716f60762daf6bdc34ba4563a5b',1,'cv::cudev::operator||(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eb7dc78006628d46caf362876324bfd',1,'cv::cudev::operator||(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95813948539b789f7529edc7fec1b313',1,'cv::cudev::operator||(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391980191d7c6907415884f3893e4622',1,'cv::cudev::operator||(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab52b978af7010683e959b7f5961f609c',1,'cv::cudev::operator||(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3c33ae535cb54e41e989a2e26834450',1,'cv::cudev::operator||(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed613e1f82f7862a55e3133e0b2ea94b',1,'cv::cudev::operator||(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c9970228fa884a956021c0cebfe15e5',1,'cv::cudev::operator||(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc178b7c15f18971eb20fffbb9a887a7',1,'cv::cudev::operator||(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d5361965c51f7ca2fe416200eb560d7',1,'cv::cudev::operator||(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487430a598578322fad0872d8e6ea35',1,'cv::cudev::operator||(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f85d3d5f36760dd63779885fef347fc',1,'cv::cudev::operator||(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0716b8368db9bfe6147ff620abcaf320',1,'cv::cudev::operator||(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3592b47fa7aa798a21f19a79a3a2d',1,'cv::cudev::operator||(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86fa4d24a51bc0fdb27624637e4162e7',1,'cv::cudev::operator||(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb7e65838ac0a9b1d7beac8bbf01b0e1',1,'cv::cudev::operator||(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9feff133da5c0cb798cc33b19fbd9ed2',1,'cv::cudev::operator||(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0995ff62918197fe40f2bea8e2b37898',1,'cv::cudev::operator||(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14791b0a2e98ba50d90b77b9d63768c3',1,'cv::cudev::operator||(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae3e389c0e99795f9a710bd9d7cd7893',1,'cv::cudev::operator||(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac554616aa3c8e0f521084e7fdffb3338',1,'cv::cudev::operator||(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e998efb0b51d4b11c8166bc17652e8f',1,'cv::cudev::operator||(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff58076f49066c7da5f88773b94eccca',1,'cv::cudev::operator||(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa98a4d1808e3e161362ed3709ac3b76f',1,'cv::cudev::operator||(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630796daa4fa81bd3480cccdd6208ce0',1,'cv::cudev::operator||(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1608d98a47346871d348ee3148a07c1a',1,'cv::cudev::operator||(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab756a072938395df21755c1b6a904d',1,'cv::cudev::operator||(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff73a5437bdeffdeb0b0c679cf39443b',1,'cv::cudev::operator||(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2b6b4c57ef47d6c51cc19656e57dc0',1,'cv::cudev::operator||(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ae692a8fbb489bb9e1745d7065fa41f',1,'cv::cudev::operator||(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee77151b150eacdfbd738bbd951de91',1,'cv::cudev::operator||(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7bb01e03b921b536c9de83900f120cb',1,'cv::cudev::operator||(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb998884b15432012259b70ee9eff749',1,'cv::cudev::operator||(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6139801e245820e8d980eb9fa19227ae',1,'cv::cudev::operator||(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba01bc6fa2a85a61bc572ee53396c0d',1,'cv::cudev::operator||(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8dc5f6ba926a32a8bb43a71f974f71f3',1,'cv::cudev::operator||(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5cd0e8199aa6ece5c42b6d469df866d',1,'cv::cudev::operator||(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3283fe040cbd0280fae5affaa5a577c3',1,'cv::cudev::operator||(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30c84efa97656970fb477d1ac42a077a',1,'cv::cudev::operator||(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae96a32168030467d5053c0f8bda7dd1b',1,'cv::cudev::operator||(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89385a5dbfdb1ef20b2e838ad9ec15cd',1,'cv::cudev::operator||(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fafcbb93a3a84b83a0d2d4e0609100d',1,'cv::cudev::operator||(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga848a2952f43a7226971f5d2426afbc8a',1,'cv::cudev::operator||(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf9201cd6a194985ee8dc16efad11954',1,'cv::cudev::operator||(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba6a7eed88b7ef37db22ace6732f6174',1,'cv::cudev::operator||(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44648e106e79365765d8081617546291',1,'cv::cudev::operator||(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a03a718dffc89a29648a361f61ba315',1,'cv::cudev::operator||(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade405ae7fba00188385f79da087b473d',1,'operator||(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67336d4da1a1a0e097576e110e322d17',1,'operator||(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d9325273f75ec46a5d0ccaa698dcab2',1,'operator||(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a350991d905802482a4a52516296256',1,'operator||(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd38e92dca97e14285cb0a994eac2eb2',1,'operator||(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1cf8719bfe35c1ce58b69439440ebb',1,'operator||(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga407966ca821a5b21a0fa3669273ce155',1,'operator||(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3f1b3a6297712114fb1528180bf4d5d',1,'operator||(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa60211ccc7148f580c9213f98d57d852',1,'operator||(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc492c09a30238356c29f992f434bbb',1,'operator||(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab229fbb04aea1adaf4ad5a99495035b9',1,'operator||(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac068c500d749dcf1c1b633a71343bf64',1,'operator||(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfceb475fab9bf020cc18a7d00ce68fa',1,'operator||(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga970bfbba082e36b082ec64f178fa4bc4',1,'operator||(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451cabb9165a8cb76c8b8281a48a74c3',1,'operator||(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ed51988f3b066b935628ca0ca76c806',1,'operator||(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56be341fd82bc471dc3727ac767df94d',1,'operator||(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43139046dc0327bc12a3405a63c93e78',1,'operator||(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga759c70e663c4ff4e8d2ae8217d47a7d7',1,'operator||(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64af392441e02098f668b91b581d6158',1,'operator||(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9dfe768a49878db05bdb91ebe5a8759b',1,'operator||(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga292fb2e70406a170f98347e3d2110db8',1,'operator||(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20d93bcf778f16d1853957cc42ff9eab',1,'operator||(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce18a713dc4adf2e6fc8841b69a7639',1,'operator||(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf45510b81f8e1759112cecd4b5a4aa3',1,'operator||(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fe1c8b48957c39413aac5e3ffd90376',1,'operator||(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b56bd1f805e2cc2a433d784ea26764b',1,'operator||(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51f6411482c1c1dc459307997d262caa',1,'operator||(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae01ca019d7b9f4b726b7017dccfb97eb',1,'operator||(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c9b224b12822bc42b33d5371cf7cef4',1,'operator||(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdb8f03f5e8aded2d1c1f5b674f8d0be',1,'operator||(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga682b9e8e6d24725fbfd14afe04c746cc',1,'operator||(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f2c04274bc2e9ef0c0e64e835272570',1,'operator||(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9613bf79ecb44e0124d987c0dc603c0e',1,'operator||(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96c371efcc9fa6314c3997cabac8de8e',1,'operator||(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebbcb4c326b4d6504cd9400ac933f53e',1,'operator||(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6a798890ec4e1c957610419cbc07fa3',1,'operator||(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0637cf031452de7f45462f4cf7d20f0',1,'operator||(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3532b09926ae239bbfdcb638f8602895',1,'operator||(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga625848bfaa38a86a0132a1771535fddb',1,'operator||(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c08c399ce28a20e5849c10236e3ec1e',1,'operator||(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga446ac73d6fc9c701bf235f9530e05486',1,'operator||(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bdb1e714d4966bc3b89850c3f223aa6',1,'operator||(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d607a72c6d5edbf0c5f0defadeecfe9',1,'operator||(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc57b8d10acf24138375fc21e1799aeb',1,'operator||(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b65fb035d930940ab0736ddbc0519fc',1,'operator||(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1593e87e954982987925c25988dab81a',1,'operator||(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0b4e24f07cae0bd5ef2032f1895b44',1,'operator||(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb0588dab343533c00fe007f4e019f29',1,'operator||(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7db7c5c12deeb79a3ad18e230fd0028',1,'operator||(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99d4f17ca75885550288386f0959cfa5',1,'operator||(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56bd222aa931f4a2f6c330e6e49ed71c',1,'operator||(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53fea0cb9bdf3c6ad83ef37fe04f24dc',1,'operator||(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c523f9819c7a99755990d8ed6b08504',1,'operator||(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga093ad1e54e64a7cccf3782b2410172e3',1,'operator||(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3bb180e11c140a1860d1c7282f3f4c5',1,'operator||(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcd6bed19993a3dec96454714e056e3c',1,'operator||(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8d59bf11b4243a05cd6cc3456fa3278',1,'operator||(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga035765656c86485e88a7ffeedff10886',1,'operator||(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c72b384daef54b49c99c95bb6e5d236',1,'operator||(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac790b4177372769ebcb41bf113cc07d8',1,'operator||(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444bdacd77a60792457a032271d6d8cc',1,'operator||(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41de5b9e5a723be85cb439a1c08f7ce9',1,'operator||(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5f81c65260b22ae9af48906f448382',1,'operator||(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28d8dab796f6cc5d9efbba9a4a140d4',1,'operator||(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32f816f6e9ef55e8af7d1076b934d769',1,'operator||(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae58e21e5c4f719ccbeff08445d7c6fdc',1,'operator||(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57922b91c42d3f3ec0d95961bb252c2a',1,'operator||(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bd2ec7511fa65af12e0c31e7eca6cf1',1,'operator||(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad435bf12fa84bd6238bd536719b8a55d',1,'operator||(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace641577e19ea3b0204727ec67a54b77',1,'operator||(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3ed13bdecfdf8509917b6128cbdd7b',1,'operator||(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a42dd360c68ec429b3a9abd29792217',1,'operator||(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62831716f60762daf6bdc34ba4563a5b',1,'operator||(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eb7dc78006628d46caf362876324bfd',1,'operator||(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95813948539b789f7529edc7fec1b313',1,'operator||(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391980191d7c6907415884f3893e4622',1,'operator||(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab52b978af7010683e959b7f5961f609c',1,'operator||(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3c33ae535cb54e41e989a2e26834450',1,'operator||(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed613e1f82f7862a55e3133e0b2ea94b',1,'operator||(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c9970228fa884a956021c0cebfe15e5',1,'operator||(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc178b7c15f18971eb20fffbb9a887a7',1,'operator||(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d5361965c51f7ca2fe416200eb560d7',1,'operator||(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487430a598578322fad0872d8e6ea35',1,'operator||(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f85d3d5f36760dd63779885fef347fc',1,'operator||(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0716b8368db9bfe6147ff620abcaf320',1,'operator||(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3592b47fa7aa798a21f19a79a3a2d',1,'operator||(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86fa4d24a51bc0fdb27624637e4162e7',1,'operator||(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb7e65838ac0a9b1d7beac8bbf01b0e1',1,'operator||(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9feff133da5c0cb798cc33b19fbd9ed2',1,'operator||(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0995ff62918197fe40f2bea8e2b37898',1,'operator||(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14791b0a2e98ba50d90b77b9d63768c3',1,'operator||(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae3e389c0e99795f9a710bd9d7cd7893',1,'operator||(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac554616aa3c8e0f521084e7fdffb3338',1,'operator||(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e998efb0b51d4b11c8166bc17652e8f',1,'operator||(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff58076f49066c7da5f88773b94eccca',1,'operator||(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa98a4d1808e3e161362ed3709ac3b76f',1,'operator||(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630796daa4fa81bd3480cccdd6208ce0',1,'operator||(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1608d98a47346871d348ee3148a07c1a',1,'operator||(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab756a072938395df21755c1b6a904d',1,'operator||(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff73a5437bdeffdeb0b0c679cf39443b',1,'operator||(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2b6b4c57ef47d6c51cc19656e57dc0',1,'operator||(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ae692a8fbb489bb9e1745d7065fa41f',1,'operator||(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee77151b150eacdfbd738bbd951de91',1,'operator||(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7bb01e03b921b536c9de83900f120cb',1,'operator||(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb998884b15432012259b70ee9eff749',1,'operator||(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6139801e245820e8d980eb9fa19227ae',1,'operator||(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba01bc6fa2a85a61bc572ee53396c0d',1,'operator||(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8dc5f6ba926a32a8bb43a71f974f71f3',1,'operator||(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5cd0e8199aa6ece5c42b6d469df866d',1,'operator||(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3283fe040cbd0280fae5affaa5a577c3',1,'operator||(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30c84efa97656970fb477d1ac42a077a',1,'operator||(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae96a32168030467d5053c0f8bda7dd1b',1,'operator||(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89385a5dbfdb1ef20b2e838ad9ec15cd',1,'operator||(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fafcbb93a3a84b83a0d2d4e0609100d',1,'operator||(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga848a2952f43a7226971f5d2426afbc8a',1,'operator||(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf9201cd6a194985ee8dc16efad11954',1,'operator||(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba6a7eed88b7ef37db22ace6732f6174',1,'operator||(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44648e106e79365765d8081617546291',1,'operator||(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a03a718dffc89a29648a361f61ba315',1,'operator||(const double2 &a, double s)(Global Namespace)']]], - ['operator_7e_356',['operator~',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69ba8f5d451de974d9aa514cdbbb1120',1,'cv::MatExpr::operator~(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69ba8f5d451de974d9aa514cdbbb1120',1,'cv::MatExpr::operator~(const Mat &m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a2cdeed3169c5dbfd617f68bbef6457ee',1,'std::bitset::operator~()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aed8f061579e182d2d8249f37a11de6c4',1,'std::tr2::dynamic_bitset::operator~()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga88b2ec0fbd1864a99c09d24f5b39e16d',1,'std::valarray::operator~()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga88b2ec0fbd1864a99c09d24f5b39e16d',1,'valarray< size_t >::operator~()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6238e30480f4a52f3b30d5c21bbbadb1',1,'cv::operator~()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf198524c2b506a2c29566cf7c9ae5e19',1,'cv::cudev::operator~(const Expr< Body > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf5b7bc46f1c4ffac38c938fdbea0d16',1,'cv::cudev::operator~(const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4618266096d4f1e47a4cd6967fb84fc3',1,'cv::cudev::operator~(const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8deb59fd638ca954bbdaf55f76a897',1,'cv::cudev::operator~(const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3055d07443d2275c1d12b97bdf297fce',1,'cv::cudev::operator~(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c754a9105964639a463dadebfa4176',1,'cv::cudev::operator~(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d4f587e0787e85c7237f061c7f5629',1,'cv::cudev::operator~(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77e7214b716a6e24b6c0ad5100723acb',1,'cv::cudev::operator~(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa20f0d48b258a29f1f78dc3bcd155f2',1,'cv::cudev::operator~(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bb7b251d40b57f97ee8761816827d5f',1,'cv::cudev::operator~(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cca9e55f0124be8c28f031dde68ff82',1,'cv::cudev::operator~(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga838e1acadd4adf72d05375901877406a',1,'cv::cudev::operator~(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8c1a39515d09b32e3d25441c5cd129a',1,'cv::cudev::operator~(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf372f82a0e3f18ff74490509c8fb3600',1,'cv::cudev::operator~(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga077d19d04f77129e7fdb284d42bc78ee',1,'cv::cudev::operator~(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa789cd510fcff4984885dcdfbb618018',1,'cv::cudev::operator~(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7d9565b8e27201dbcefa113a9c16c8',1,'cv::cudev::operator~(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga861b8704201b4e6e2d55a9abd798161a',1,'cv::cudev::operator~(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195352c298ca60f9f1427d993b5aeb6c',1,'cv::cudev::operator~(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa4e3b79d78611d2031c8d21420d4ab',1,'cv::cudev::operator~(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133c3fb71ea8172a37867390be557400',1,'cv::cudev::operator~(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7d6682dd37b7ea68625ab7a1b693926',1,'cv::cudev::operator~(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9cb1d6029d987bdbd57fb47193ee591',1,'cv::cudev::operator~(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1e50a02cb728d3a0a936c6239263d0',1,'cv::cudev::operator~(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79cc15f84516fa21851f6c9748497891',1,'cv::cudev::operator~(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37a2be39fcfb682e1e91697df152cdd3',1,'cv::cudev::operator~(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8e1f246e66d56a7a4315f926d64938e',1,'cv::cudev::operator~(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecbd81337a2a8039c93dc0f6b7f322d4',1,'cv::cudev::operator~(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6238e30480f4a52f3b30d5c21bbbadb1',1,'operator~(const v_reg< _Tp, n > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf198524c2b506a2c29566cf7c9ae5e19',1,'operator~(const Expr< Body > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf5b7bc46f1c4ffac38c938fdbea0d16',1,'operator~(const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4618266096d4f1e47a4cd6967fb84fc3',1,'operator~(const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8deb59fd638ca954bbdaf55f76a897',1,'operator~(const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3055d07443d2275c1d12b97bdf297fce',1,'operator~(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c754a9105964639a463dadebfa4176',1,'operator~(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d4f587e0787e85c7237f061c7f5629',1,'operator~(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77e7214b716a6e24b6c0ad5100723acb',1,'operator~(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa20f0d48b258a29f1f78dc3bcd155f2',1,'operator~(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bb7b251d40b57f97ee8761816827d5f',1,'operator~(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cca9e55f0124be8c28f031dde68ff82',1,'operator~(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga838e1acadd4adf72d05375901877406a',1,'operator~(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8c1a39515d09b32e3d25441c5cd129a',1,'operator~(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf372f82a0e3f18ff74490509c8fb3600',1,'operator~(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga077d19d04f77129e7fdb284d42bc78ee',1,'operator~(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa789cd510fcff4984885dcdfbb618018',1,'operator~(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7d9565b8e27201dbcefa113a9c16c8',1,'operator~(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga861b8704201b4e6e2d55a9abd798161a',1,'operator~(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195352c298ca60f9f1427d993b5aeb6c',1,'operator~(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa4e3b79d78611d2031c8d21420d4ab',1,'operator~(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133c3fb71ea8172a37867390be557400',1,'operator~(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7d6682dd37b7ea68625ab7a1b693926',1,'operator~(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9cb1d6029d987bdbd57fb47193ee591',1,'operator~(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1e50a02cb728d3a0a936c6239263d0',1,'operator~(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79cc15f84516fa21851f6c9748497891',1,'operator~(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37a2be39fcfb682e1e91697df152cdd3',1,'operator~(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8e1f246e66d56a7a4315f926d64938e',1,'operator~(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecbd81337a2a8039c93dc0f6b7f322d4',1,'operator~(const uint1 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ad3de70b7c5c74267276903c86628e239',1,'std::regex_constants::operator~(syntax_option_type __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a2aeb16521b6691e19cb344505b084271',1,'std::regex_constants::operator~(match_flag_type __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga88b2ec0fbd1864a99c09d24f5b39e16d',1,'operator~()(Global Namespace)']]], - ['oplandiplparvo_357',['OPLandIplParvo',['https://docs.opencv.org/4.2.0/d2/df5/structcv_1_1bioinspired_1_1RetinaParameters.html#a22079e2a0666d7f0add1e8bb2cd63500',1,'cv::bioinspired::RetinaParameters']]], - ['oplandiplparvoparameters_358',['OPLandIplParvoParameters',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters'],['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#a397e52e1f6738f907169910800c6aae7',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters::OPLandIplParvoParameters()']]], - ['opt_5frandom_2eh_359',['opt_random.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00713.html',1,'']]], - ['optflow_2ehpp_360',['optflow.hpp',['https://docs.opencv.org/4.2.0/de/d67/optflow_8hpp.html',1,'']]], - ['optflow_5ffarneback_5fgaussian_361',['OPTFLOW_FARNEBACK_GAUSSIAN',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a4ffe37adbc548e44a61025a26a1914aa',1,'cv::OPTFLOW_FARNEBACK_GAUSSIAN'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a4ffe37adbc548e44a61025a26a1914aa',1,'OPTFLOW_FARNEBACK_GAUSSIAN(Global Namespace)']]], - ['optflow_5flk_5fget_5fmin_5feigenvals_362',['OPTFLOW_LK_GET_MIN_EIGENVALS',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08add75f0bd85d1bd739b39b8900bc12c58',1,'cv::OPTFLOW_LK_GET_MIN_EIGENVALS'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08add75f0bd85d1bd739b39b8900bc12c58',1,'OPTFLOW_LK_GET_MIN_EIGENVALS(Global Namespace)']]], - ['optflow_5fuse_5finitial_5fflow_363',['OPTFLOW_USE_INITIAL_FLOW',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a9d4430ac75199af0cf6fcdefba30eafe',1,'cv::OPTFLOW_USE_INITIAL_FLOW'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a9d4430ac75199af0cf6fcdefba30eafe',1,'OPTFLOW_USE_INITIAL_FLOW(Global Namespace)']]], - ['optflowestimator_364',['optFlowEstimator',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#a2febcdca26690c112002949348ade823',1,'cv::videostab::MotionInpainter']]], - ['optical_20flow_365',['Optical Flow',['https://docs.opencv.org/4.2.0/d7/d3f/group__cudaoptflow.html',1,'Optical Flow'],['https://docs.opencv.org/4.2.0/d4/dee/tutorial_optical_flow.html',1,'Optical Flow'],['https://docs.opencv.org/4.2.0/d7/d8b/tutorial_py_lucas_kanade.html',1,'Optical Flow'],['https://docs.opencv.org/4.2.0/db/d7f/tutorial_js_lucas_kanade.html',1,'Optical Flow']]], - ['optical_20flow_20algorithms_366',['Optical Flow Algorithms',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html',1,'']]], - ['optical_20illusions_367',['Processing images causing optical illusions',['https://docs.opencv.org/4.2.0/d7/d8f/tutorial_bioinspired_retina_illusion.html',1,'']]], - ['optical_5fflow_2ehpp_368',['optical_flow.hpp',['https://docs.opencv.org/4.2.0/d2/dc3/superres_2include_2opencv2_2superres_2optical__flow_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d49/videostab_2include_2opencv2_2videostab_2optical__flow_8hpp.html',1,'(Global Namespace)']]], - ['optical_5fflow_2emarkdown_369',['optical_flow.markdown',['https://docs.opencv.org/4.2.0/db/d50/optical__flow_8markdown.html',1,'']]], - ['opticalflowdual_5ftvl1_370',['OpticalFlowDual_TVL1',['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html',1,'cv::cuda']]], - ['opticalflowestimator_371',['opticalFlowEstimator',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a490cd8c016f7b4d181daedb55eec28e9',1,'cv::videostab::KeypointBasedMotionEstimator']]], - ['opticalflowpcaflow_372',['OpticalFlowPCAFlow',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html',1,'cv::optflow::OpticalFlowPCAFlow'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#afe6dd4b33d08e519a8ef2d0798564040',1,'cv::optflow::OpticalFlowPCAFlow::OpticalFlowPCAFlow()']]], - ['optim_2ehpp_373',['optim.hpp',['https://docs.opencv.org/4.2.0/d3/d46/optim_8hpp.html',1,'']]], - ['optimization_20algorithms_374',['Optimization Algorithms',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html',1,'']]], - ['optimize_375',['optimize',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a77f83de09c72048a75a66344f0bfb2f3',1,'std::regex_constants']]], - ['optimizeextrinsics_376',['optimizeExtrinsics',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#ac4c4d52808b8878e134c22c09e0b5717',1,'cv::multicalib::MultiCameraCalibration']]], - ['optional_377',['optional',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html',1,'cv::util::optional< T >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10071.html',1,'std::experimental::fundamentals_v1::optional< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01016.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#ab22465abe81369037764c6ac1b799273',1,'cv::util::optional::optional()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a09eaedc3d5761ccc237a213e6f4f8d94',1,'cv::util::optional::optional(const optional &)=default'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#aad5e2bf28fd67eac2c683e189d25f9e0',1,'cv::util::optional::optional(T &&value) noexcept'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a63127f3a74565eec28548a24e18c2716',1,'cv::util::optional::optional(const T &value) noexcept'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#ab7e3745f571967e65d36bc7eeb640d7f',1,'cv::util::optional::optional(optional &&) noexcept']]], - ['optional_20values_378',['Optional values',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html',1,'']]], - ['optional_2ehpp_379',['optional.hpp',['https://docs.opencv.org/4.2.0/db/dd5/optional_8hpp.html',1,'']]], - ['optional_5flock_5fguard_380',['optional_lock_guard',['https://docs.opencv.org/4.2.0/d3/de8/classcv_1_1utils_1_1optional__lock__guard.html',1,'cv::utils::optional_lock_guard< class >'],['https://docs.opencv.org/4.2.0/d3/de8/classcv_1_1utils_1_1optional__lock__guard.html#a8a7a28c1f9a4153a89b806ce065106e1',1,'cv::utils::optional_lock_guard::optional_lock_guard()']]], - ['optional_5fshared_5flock_5fguard_381',['optional_shared_lock_guard',['https://docs.opencv.org/4.2.0/d2/ddd/classcv_1_1utils_1_1optional__shared__lock__guard.html',1,'cv::utils::optional_shared_lock_guard< class >'],['https://docs.opencv.org/4.2.0/d2/ddd/classcv_1_1utils_1_1optional__shared__lock__guard.html#a87856795a393a792d0588da931a6f6d6',1,'cv::utils::optional_shared_lock_guard::optional_shared_lock_guard()']]], - ['options_382',['options',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a42d9d79073379f1e75b0f2c49879ed5b',1,'Eigen::SuperLUBase::options()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a42d9d79073379f1e75b0f2c49879ed5b',1,'SuperLUBase< _MatrixType, SuperILU< _MatrixType > >::options()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a42d9d79073379f1e75b0f2c49879ed5b',1,'SuperLUBase< _MatrixType, SuperLU< _MatrixType > >::options()']]], - ['or_20maximum_383',['Element-wise minimum or maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'']]], - ['or_20miss_384',['Hit-or-Miss',['https://docs.opencv.org/4.2.0/db/d06/tutorial_hitOrMiss.html',1,'']]], - ['or8u_385',['or8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabe8e8d763760f73eb41f9b555b92a6a3',1,'cv::hal::or8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabe8e8d763760f73eb41f9b555b92a6a3',1,'or8u()(Global Namespace)']]], - ['or_5fimagenet_386',['OR_imagenet',['https://docs.opencv.org/4.2.0/db/df7/classcv_1_1datasets_1_1OR__imagenet.html',1,'cv::datasets']]], - ['or_5fimagenet_2ehpp_387',['or_imagenet.hpp',['https://docs.opencv.org/4.2.0/d2/d38/or__imagenet_8hpp.html',1,'']]], - ['or_5fimagenetobj_388',['OR_imagenetObj',['https://docs.opencv.org/4.2.0/de/d3f/structcv_1_1datasets_1_1OR__imagenetObj.html',1,'cv::datasets']]], - ['or_5fmnist_389',['OR_mnist',['https://docs.opencv.org/4.2.0/d9/d92/classcv_1_1datasets_1_1OR__mnist.html',1,'cv::datasets']]], - ['or_5fmnist_2ehpp_390',['or_mnist.hpp',['https://docs.opencv.org/4.2.0/dc/d44/or__mnist_8hpp.html',1,'']]], - ['or_5fmnistobj_391',['OR_mnistObj',['https://docs.opencv.org/4.2.0/d0/d2c/structcv_1_1datasets_1_1OR__mnistObj.html',1,'cv::datasets']]], - ['or_5fpascal_392',['OR_pascal',['https://docs.opencv.org/4.2.0/d4/d7e/classcv_1_1datasets_1_1OR__pascal.html',1,'cv::datasets']]], - ['or_5fpascal_2ehpp_393',['or_pascal.hpp',['https://docs.opencv.org/4.2.0/d0/d57/or__pascal_8hpp.html',1,'']]], - ['or_5fpascalobj_394',['OR_pascalObj',['https://docs.opencv.org/4.2.0/d0/db6/structcv_1_1datasets_1_1OR__pascalObj.html',1,'cv::datasets']]], - ['or_5fsun_395',['OR_sun',['https://docs.opencv.org/4.2.0/da/d69/classcv_1_1datasets_1_1OR__sun.html',1,'cv::datasets']]], - ['or_5fsun_2ehpp_396',['or_sun.hpp',['https://docs.opencv.org/4.2.0/d4/dc0/or__sun_8hpp.html',1,'']]], - ['or_5fsunobj_397',['OR_sunObj',['https://docs.opencv.org/4.2.0/d8/d74/structcv_1_1datasets_1_1OR__sunObj.html',1,'cv::datasets']]], - ['orange_398',['orange',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1a1069a4fd84db013399ffc68c202901',1,'cv::viz::Color']]], - ['orange_5fred_399',['orange_red',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a6d78c79310b79a16fd8100b80d50aeef',1,'cv::viz::Color']]], - ['orb_400',['ORB',['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html',1,'cv::cuda::ORB'],['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html',1,'cv::ORB']]], - ['orb_20oriented_20fast_20and_20rotated_20brief_401',['ORB (Oriented FAST and Rotated BRIEF)',['https://docs.opencv.org/4.2.0/d1/d89/tutorial_py_orb.html',1,'']]], - ['orb_20planar_20tracking_402',['AKAZE and ORB planar tracking',['https://docs.opencv.org/4.2.0/dc/d16/tutorial_akaze_tracking.html',1,'']]], - ['order_5fof_5fkey_403',['order_of_key',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#a1c33a80afedc268c76b5ad8468fb84ee',1,'__gnu_pbds::tree_order_statistics_node_update::order_of_key()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#afc18e57812078123f3fb91a1148ec5f5',1,'__gnu_pbds::trie_order_statistics_node_update::order_of_key(key_const_reference) const']]], - ['order_5fof_5fprefix_404',['order_of_prefix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#a5baafac1f227b055faf0f836ccf166fc',1,'__gnu_pbds::trie_order_statistics_node_update']]], - ['order_5fpreserving_405',['order_preserving',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html#ace925c8be06b3640abb7b6f486290daba7a8084f7409a761ceaa0de948e82363d',1,'__gnu_pbds::container_traits']]], - ['ordered_5fbase_2eh_406',['ordered_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00818.html',1,'']]], - ['ordered_5fjson_407',['ordered_json',['https://nlohmann.github.io/json/doxygen/namespacenlohmann_ad53cef358adfa7f07cea23eb1e28b9ea.html#ad53cef358adfa7f07cea23eb1e28b9ea',1,'nlohmann']]], - ['ordered_5fmap_408',['ordered_map',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map.html',1,'nlohmann::ordered_map< class, class, class, class >'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a87938c10b76510dac00412d2cb5fd1e4.html#a87938c10b76510dac00412d2cb5fd1e4',1,'nlohmann::ordered_map::ordered_map(const Allocator &alloc=Allocator())'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a9d25efb51325cc1be027b8ea00c1f8b8.html#a9d25efb51325cc1be027b8ea00c1f8b8',1,'nlohmann::ordered_map::ordered_map(It first, It last, const Allocator &alloc=Allocator())'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a0482ea79e7786367a2d9b5c789c091ce.html#a0482ea79e7786367a2d9b5c789c091ce',1,'nlohmann::ordered_map::ordered_map(std::initializer_list< T > init, const Allocator &alloc=Allocator())']]], - ['orderingmethods_20module_409',['OrderingMethods module',['https://eigen.tuxfamily.org/dox/group__OrderingMethods__Module.html',1,'']]], - ['orders_410',['Storage orders',['https://eigen.tuxfamily.org/dox/group__TopicStorageOrders.html',1,'']]], - ['org_411',['org',['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#af578c3e129f7a24b1c0d5513f46c7809',1,'cv::gapi::wip::draw::FText::org'],['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html#a015abca43b85577f24c46b9b72ce2e45',1,'cv::gapi::wip::draw::Image::org'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a8af3274325bafac592a8b5df6d49921b',1,'cv::gapi::wip::draw::Text::org']]], - ['oriented_20fast_20and_20rotated_20brief_412',['ORB (Oriented FAST and Rotated BRIEF)',['https://docs.opencv.org/4.2.0/d1/d89/tutorial_py_orb.html',1,'']]], - ['orig_5fresol_413',['ORIG_RESOL',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#af864448487371edc19bc3034ab2479b6',1,'cv::Stitcher']]], - ['origdata_414',['origdata',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#aee30a2d2615e8e4d7fcfb2c893ac9839',1,'cv::UMatData']]], - ['original_5fdata_415',['original_data',['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a6cde45f9caf9abd917d203459c7adfcb',1,'cv::detail::tracked_cv_mat::original_data'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a8239876c6987cec486138493596be8b7',1,'cv::detail::tracked_cv_umat::original_data']]], - ['original_5fimage_416',['original_image',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#af6dbad308d1f29c33cdefd2cef98c31d',1,'cv::datasets::FR_adienceObj']]], - ['originalumatdata_417',['originalUMatData',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4bdd72ed97e5afd923d661cd6e6f6471',1,'cv::UMatData']]], - ['os_5fdefines_2eh_418',['os_defines.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00716.html',1,'']]], - ['ostream_419',['ostream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00116.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga55d4c0674fbacb7514ae76310aeb4bf8',1,'std::ostream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga55d4c0674fbacb7514ae76310aeb4bf8',1,'ostream(Global Namespace)']]], - ['ostream_2etcc_420',['ostream.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00434.html',1,'']]], - ['ostream_5finsert_2eh_421',['ostream_insert.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00437.html',1,'']]], - ['ostream_5fiterator_422',['ostream_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html',1,'std::ostream_iterator< class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a43b5a82905d5237921fc78c44455950a',1,'std::ostream_iterator::ostream_iterator(ostream_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#afa776b7965fc2d27f9281944542be2d8',1,'std::ostream_iterator::ostream_iterator(ostream_type &__s, const _CharT *__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a6f93dbe2e9972260dd0ab4b869967e26',1,'std::ostream_iterator::ostream_iterator(const ostream_iterator &__obj)']]], - ['ostream_5fjoiner_423',['ostream_joiner',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10023.html',1,'std::experimental::fundamentals_v2']]], - ['ostream_5ftype_424',['ostream_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#aa8e002bf7b5552b4b9117198b99050ab',1,'std::ostream_iterator::ostream_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#aa8e002bf7b5552b4b9117198b99050ab',1,'std::ostream_iterator::ostream_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ab1268dc45f0682f612da8e1c6fd7b0ac',1,'std::ostreambuf_iterator::ostream_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ab1268dc45f0682f612da8e1c6fd7b0ac',1,'std::ostreambuf_iterator::ostream_type']]], - ['ostreambuf_5fiterator_425',['ostreambuf_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html',1,'std::ostreambuf_iterator< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ac9080f23edb16ede8dc2e24e84f75207',1,'std::ostreambuf_iterator::ostreambuf_iterator(ostream_type &__s) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#aef4876e87478fee9493302260f2c1b36',1,'std::ostreambuf_iterator::ostreambuf_iterator(streambuf_type *__s) noexcept']]], - ['ostringstream_426',['ostringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gac2ba708c34afa6e120c07e56bfce9cd3',1,'std::ostringstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gac2ba708c34afa6e120c07e56bfce9cd3',1,'ostringstream(Global Namespace)']]], - ['other_427',['other',['https://docs.opencv.org/4.2.0/d1/d1d/structcv_1_1cudev_1_1Sum_1_1rebind.html#aaae743f5deb12eaeced97003dc51616c',1,'cv::cudev::Sum::rebind::other'],['https://docs.opencv.org/4.2.0/d3/dd1/structcv_1_1cudev_1_1Avg_1_1rebind.html#a30a46b30d73c26c6ad3786ef2ad8f3df',1,'cv::cudev::Avg::rebind::other'],['https://docs.opencv.org/4.2.0/d2/dff/structcv_1_1cudev_1_1Min_1_1rebind.html#acfe7a9701bc3ba064c760d28f8947775',1,'cv::cudev::Min::rebind::other'],['https://docs.opencv.org/4.2.0/d1/d7c/structcv_1_1cudev_1_1Max_1_1rebind.html#a2baa5b57935c857e51bd95ff22e667f6',1,'cv::cudev::Max::rebind::other']]], - ['other_20classes_428',['Extending MatrixBase (and other classes)',['https://eigen.tuxfamily.org/dox/TopicCustomizing_Plugins.html',1,'']]], - ['other_20doxygen_20projects_429',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], - ['other_20intel_20perceptual_20computing_20sdk_20compatible_20depth_20sensors_430',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], - ['other_20openni_20compatible_20depth_20sensors_431',['Using Kinect and other OpenNI compatible depth sensors',['https://docs.opencv.org/4.2.0/d7/d6f/tutorial_kinect_openni.html',1,'']]], - ['other_5ferror_432',['other_error',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6fc373c99facc37aadbc5651b3d6631d.html#a6fc373c99facc37aadbc5651b3d6631d',1,'nlohmann::basic_json']]], - ['others_5fall_433',['others_all',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a5bea7ea33126a22add82c5809bfa6366',1,'others_all(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a5bea7ea33126a22add82c5809bfa6366',1,'others_all(Global Namespace)']]], - ['others_5fexec_434',['others_exec',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a5a2e0fba544a04c9e3f47dc370c28bf2',1,'others_exec(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a5a2e0fba544a04c9e3f47dc370c28bf2',1,'others_exec(Global Namespace)']]], - ['others_5fread_435',['others_read',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145ae1ea303787306dda3e50a432832c998a',1,'others_read(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145ae1ea303787306dda3e50a432832c998a',1,'others_read(Global Namespace)']]], - ['others_5fwrite_436',['others_write',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145af9d2b2426ee261e7ab294f317c5115bf',1,'others_write(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145af9d2b2426ee261e7ab294f317c5115bf',1,'others_write(Global Namespace)']]], - ['our_20applications_437',['Adding a Trackbar to our applications!',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'']]], - ['out_438',['out',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_ios< char, _Traits >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_iostream< char >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_istream< char >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_istream< char, _Traits >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_ostream< char >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_ostream< char, _Traits >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_fstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ifstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ios::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_iostream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_istream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_istringstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ofstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ostream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ostringstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_stringstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::ios_base::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< _InternT, _ExternT, encoding_state >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< char, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< char16_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< char32_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< wchar_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'codecvt< _Elem, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::__codecvt_abstract_base::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< _InternT, _ExternT, encoding_state >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< char, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< char16_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< char32_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< wchar_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt_byname::out()']]], - ['out_439',['Out',['https://docs.opencv.org/4.2.0/dd/d98/structcv_1_1gapi_1_1ie_1_1PortCfg.html#a73601a4545cc2eea31511e6067010523',1,'cv::gapi::ie::PortCfg']]], - ['out_20of_20focus_20deblur_20filter_440',['Out-of-focus Deblur Filter',['https://docs.opencv.org/4.2.0/de/d3c/tutorial_out_of_focus_deblur_filter.html',1,'']]], - ['out_5fof_5ffocus_5fdeblur_5ffilter_2emarkdown_441',['out_of_focus_deblur_filter.markdown',['https://docs.opencv.org/4.2.0/d4/d4d/out__of__focus__deblur__filter_8markdown.html',1,'']]], - ['out_5fof_5frange_442',['out_of_range',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02807.html',1,'std::out_of_range'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a2251d8523fa6d16c0fba6388ffa2ef8c.html#a2251d8523fa6d16c0fba6388ffa2ef8c',1,'nlohmann::basic_json::out_of_range']]], - ['out_5ftag_443',['Out_Tag',['https://docs.opencv.org/4.2.0/dd/d92/structcv_1_1Out__Tag.html',1,'cv']]], - ['outargs_444',['OutArgs',['https://docs.opencv.org/4.2.0/df/d7c/classcv_1_1GKernelType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a4d3d93d4cceda20b6712ca4b0a21ceaa',1,'cv::GKernelType< K, std::function< R(Args...)> >::OutArgs'],['https://docs.opencv.org/4.2.0/dc/d2d/classcv_1_1GKernelTypeM_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a5d425af9fdadd9e84aa9ae9da620fb54',1,'cv::GKernelTypeM< K, std::function< std::tuple< R... >(Args...)> >::OutArgs'],['https://docs.opencv.org/4.2.0/dc/de8/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a3e36c5b5f896a8c38ca9ec9214cb42e8',1,'cv::GNetworkType< K, std::function< R(Args...)> >::OutArgs'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a36e3cb62226e67796bf747908a4eacf2',1,'cv::GNetworkType< K, std::function< std::tuple< R... >(Args...)> >::OutArgs']]], - ['outer_445',['outer',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Eigen::Stride::outer()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Stride< 0, Value >::outer()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::outer()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Stride< Value, 0 >::outer()']]], - ['outerindexptr_446',['outerIndexPtr',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'Eigen::SparseCompressedBase::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'Eigen::SparseCompressedBase::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Derived >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Derived >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Transpose< MatrixType > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Transpose< MatrixType > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a24c55dd8de4aca30e7c90b69aa5dca6b',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html#a3b74af754254837fc591cd9936688b95',1,'Eigen::SparseMapBase< Derived, WriteAccessors >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'Eigen::SparseMatrix::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'Eigen::SparseMatrix::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar, ColMajor, int >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar, ColMajor, int >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::outerIndexPtr() const']]], - ['outersize_447',['outerSize',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'Eigen::DenseBase::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'DenseBase< ArrayWrapper< ExpressionType > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'DenseBase< Solve< Decomposition, RhsType > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a3d6ede19db6d42074ae063bc876231b1',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'Eigen::SparseMatrix::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar, ColMajor, int >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'Eigen::SparseMatrixBase::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< Transpose< MatrixType > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::outerSize()']]], - ['outerstride_448',['OuterStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1OuterStride.html',1,'Eigen']]], - ['outerstride_449',['outerStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#ad88c60c4a2356be2c436f3264dd20b55',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::outerStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#abb333f6f10467f6f8d7b59c213dea49e',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::outerStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#afe47788156e483b9025ab320cc7f925e',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::outerStride()']]], - ['outlier_5frejection_2ehpp_450',['outlier_rejection.hpp',['https://docs.opencv.org/4.2.0/da/d94/outlier__rejection_8hpp.html',1,'']]], - ['outlierrejector_451',['outlierRejector',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a1c7ec46d4913af1d422b6accb67ddfed',1,'cv::videostab::KeypointBasedMotionEstimator']]], - ['outline_452',['OutLine',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a436e4b941c3da68fae821ed5786620b3',1,'cv::gapi::fluid::Buffer']]], - ['outlineb_453',['OutLineB',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a875c6cfa0315fbb9e1aa94153d7af378',1,'cv::gapi::fluid::Buffer']]], - ['outmatr_454',['outMatR',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#a271dfd3a4a49c4900165991414fc5342',1,'cv::GCPUContext::outMatR()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#ab6561a2ea00141e38ac8afa1f89458ab',1,'cv::GOCLContext::outMatR()']]], - ['outmeta_455',['outMeta',['https://docs.opencv.org/4.2.0/db/d4d/structcv_1_1GKernel.html#a323e65c28a1d3127987f7946a7b1e6c7',1,'cv::GKernel']]], - ['outmetas_456',['outMetas',['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#adb1e2c45cc469afe7aa98d5500aac1a4',1,'cv::GCompiled::outMetas()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ac9961bb29f6e049fcda55384877b8bb5',1,'cv::GStreamingCompiled::outMetas()']]], - ['output_457',['Output',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html',1,'Input/Output'],['../classfilters_1_1Output.html',1,'filters::Output'],['../classfilters_1_1Output.html#a48acc7be07c07f2336679a1d81a1f0e4',1,'filters::Output::Output()']]], - ['output_458',['output',['https://docs.opencv.org/4.2.0/d6/dca/tutorial_dnn_superres_upscale_image_multi.html',1,'Upscaling images: multi-output'],['https://docs.opencv.org/4.2.0/d5/d29/tutorial_dnn_superres_upscale_image_single.html',1,'Upscaling images: single-output']]], - ['output_20imgcodecs_20module_459',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], - ['output_20using_20xml_20and_20yaml_20files_460',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], - ['output_20videoio_20module_461',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], - ['output_5fiterator_5ftag_462',['output_iterator_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07695.html',1,'std']]], - ['output_5fnames_463',['output_names',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#aa8858a371b710e686b4df176c3ccd946',1,'cv::gapi::ie::detail::ParamDesc']]], - ['output_5fsigma_5ffactor_464',['output_sigma_factor',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a607c4d0a852b08b030b15751d0574eb0',1,'cv::TrackerKCF::Params']]], - ['outputarray_465',['OutputArray',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaad17fda1d0f0d1ee069aebb1df2913c0',1,'cv::OutputArray'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaad17fda1d0f0d1ee069aebb1df2913c0',1,'OutputArray(Global Namespace)']]], - ['outputarrayofarrays_466',['OutputArrayOfArrays',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga889a09549b98223016170d9b613715de',1,'cv::OutputArrayOfArrays'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga889a09549b98223016170d9b613715de',1,'OutputArrayOfArrays(Global Namespace)']]], - ['outputfuncjacobianv_467',['outputFuncJacobianV',['../classfilters_1_1ExtendedKalmanFilter.html#ae5aba910e178c4321ef56d065de092de',1,'filters::ExtendedKalmanFilter::outputFuncJacobianV'],['../classfilters_1_1Output.html#ad993de846ff252efb8bb22c99805b508',1,'filters::Output::outputFuncJacobianV()']]], - ['outputfuncjacobianx_468',['outputFuncJacobianX',['../classfilters_1_1ExtendedKalmanFilter.html#a4bdd425dd08d8425369c709bd6d1b260',1,'filters::ExtendedKalmanFilter::outputFuncJacobianX'],['../classfilters_1_1Output.html#a5c42af319c18c623e92f92a70b3d0580',1,'filters::Output::outputFuncJacobianX()']]], - ['outputnametoindex_469',['outputNameToIndex',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a60ffc8238f3fa26cd3f49daa7ac0884b',1,'cv::dnn::Layer::outputNameToIndex()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a275295575f6b1a7b5c68d414bf7530aa',1,'cv::dnn::LSTMLayer::outputNameToIndex()']]], - ['outputscount_470',['outputsCount',['https://docs.opencv.org/4.2.0/dd/df9/classcv_1_1dnn_1_1SplitLayer.html#a6baac6036050c1f496da8c18b87953c6',1,'cv::dnn::SplitLayer']]], - ['outshapes_471',['outShapes',['https://docs.opencv.org/4.2.0/db/d4d/structcv_1_1GKernel.html#aa6f01d884784857d41ecaa6fa8b30a0b',1,'cv::GKernel']]], - ['outtensor_472',['outTensor',['https://docs.opencv.org/4.2.0/de/d5f/structcv_1_1GPlaidMLContext.html#a1e1172f28b455bf4ed59e22c836e35f2',1,'cv::GPlaidMLContext']]], - ['outvalr_473',['outValR',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#a85b0ee69ff748139aabb7f94c62cc6f3',1,'cv::GCPUContext::outValR()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#ad61c8d7c7df84b5efef5db7527560cb4',1,'cv::GOCLContext::outValR()']]], - ['outvecr_474',['outVecR',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#ac63c2703e6f4e7ae1c6cf77607a4ef31',1,'cv::GCPUContext::outVecR()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a23b6577922d9c1b5b3bb835c16e76afa',1,'cv::GOCLContext::outVecR()']]], - ['outvecref_475',['outVecRef',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#aae9072800907251490f88444df8f8558',1,'cv::GCPUContext::outVecRef()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a0f5085f10ef2311591f023eedd0a0a49',1,'cv::GOCLContext::outVecRef()']]], - ['ov_5ftree_5fmap_476',['ov_tree_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html',1,'__gnu_pbds::detail']]], - ['ov_5ftree_5fmap_5f_2ehpp_477',['ov_tree_map_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01367.html',1,'']]], - ['ov_5ftree_5fmap_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_478',['ov_tree_map_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16697.html',1,'']]], - ['ov_5ftree_5fmap_5f_2fdebug_5ffn_5fimps_2ehpp_479',['ov_tree_map_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16769.html',1,'']]], - ['ov_5ftree_5fmap_5f_2ferase_5ffn_5fimps_2ehpp_480',['ov_tree_map_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16832.html',1,'']]], - ['ov_5ftree_5fmap_5f_2finfo_5ffn_5fimps_2ehpp_481',['ov_tree_map_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16967.html',1,'']]], - ['ov_5ftree_5fmap_5f_2finsert_5ffn_5fimps_2ehpp_482',['ov_tree_map_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17000.html',1,'']]], - ['ov_5ftree_5fmap_5f_2fiterators_5ffn_5fimps_2ehpp_483',['ov_tree_map_/iterators_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17051.html',1,'']]], - ['ov_5ftree_5fmap_5f_2fnode_5fiterators_2ehpp_484',['ov_tree_map_/node_iterators.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17111.html',1,'']]], - ['ov_5ftree_5fmap_5f_2fpolicy_5faccess_5ffn_5fimps_2ehpp_485',['ov_tree_map_/policy_access_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17159.html',1,'']]], - ['ov_5ftree_5fmap_5f_2fsplit_5fjoin_5ffn_5fimps_2ehpp_486',['ov_tree_map_/split_join_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17243.html',1,'']]], - ['ov_5ftree_5fmap_5f_2ftraits_2ehpp_487',['ov_tree_map_/traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17312.html',1,'']]], - ['ov_5ftree_5fnode_5fconst_5fit_5f_488',['ov_tree_node_const_it_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11863.html',1,'__gnu_pbds::detail']]], - ['ov_5ftree_5fnode_5fit_5f_489',['ov_tree_node_it_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11867.html',1,'__gnu_pbds::detail']]], - ['ov_5ftree_5ftag_490',['ov_tree_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11251.html',1,'__gnu_pbds']]], - ['overflow_491',['overflow',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'__gnu_cxx::enc_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'__gnu_cxx::stdio_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'__gnu_cxx::stdio_sync_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_filebuf< char_type, traits_type >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_streambuf< _Elem, _Tr >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_streambuf< char, _Traits >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_streambuf< char, char_traits< char > >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::basic_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::basic_streambuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::basic_stringbuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::wbuffer_convert::overflow()']]], - ['overflow_5ferror_492',['overflow_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02819.html',1,'std']]], - ['overlap_493',['overlap',['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html#aa34095c2f80741a929d8e7d3dad258c7',1,'cv::TrackerSamplerCS::Params::overlap'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#a6a56a625fb5fb0df7c63c69ce7713360',1,'cv::KeyPoint::overlap()']]], - ['overlaproi_494',['overlapRoi',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gaf9ff38a39051369119b53529b3d779ab',1,'cv::detail::overlapRoi()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gaf9ff38a39051369119b53529b3d779ab',1,'overlapRoi()(Global Namespace)']]], - ['oversampling_5famount_495',['oversampling_amount',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#ab2be0a345c572d46008ea33213e9822a',1,'cv::face::FacemarkKazemi::Params']]], - ['overview_496',['G-API Overview',['https://docs.opencv.org/4.2.0/db/d87/md_gapi_doc_slides_README.html',1,'']]], - ['overview_497',['High-level design overview',['https://docs.opencv.org/4.2.0/de/d4d/gapi_hld.html',1,'']]], - ['overview_498',['Overview',['https://docs.opencv.org/4.2.0/dc/dd6/ml_intro.html',1,'Machine Learning Overview'],['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'Video I/O with OpenCV Overview']]], - ['overwrite_5fexisting_499',['overwrite_existing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a7d62790af546be3f895e613e37b0feac',1,'overwrite_existing(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a7d62790af546be3f895e613e37b0feac',1,'overwrite_existing(Global Namespace)']]], - ['ovis_2ehpp_500',['ovis.hpp',['https://docs.opencv.org/4.2.0/d6/d50/ovis_8hpp.html',1,'']]], - ['ovx_2ehpp_501',['ovx.hpp',['https://docs.opencv.org/4.2.0/dd/ded/ovx_8hpp.html',1,'']]], - ['ovx_5fdefs_2ehpp_502',['ovx_defs.hpp',['https://docs.opencv.org/4.2.0/de/d03/ovx__defs_8hpp.html',1,'']]], - ['own_20corner_20detector_503',['Creating your own corner detector',['https://docs.opencv.org/4.2.0/d9/dbc/tutorial_generic_corner_detector.html',1,'']]], - ['own_20linear_20filters_504',['Making your own linear filters!',['https://docs.opencv.org/4.2.0/d4/dbd/tutorial_filter_2d.html',1,'']]], - ['owner_5fall_505',['owner_all',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a3e6083e076d1f7125c0bbf7070df5440',1,'owner_all(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a3e6083e076d1f7125c0bbf7070df5440',1,'owner_all(Global Namespace)']]], - ['owner_5fexec_506',['owner_exec',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a189e890869453de458a9c5c26af8359b',1,'owner_exec(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a189e890869453de458a9c5c26af8359b',1,'owner_exec(Global Namespace)']]], - ['owner_5fless_507',['owner_less',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06907.html',1,'std']]], - ['owner_5fless_3c_20shared_5fptr_3c_20_5ftp_20_3e_20_3e_508',['owner_less< shared_ptr< _Tp > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09943.html',1,'std::experimental::fundamentals_v2::owner_less< shared_ptr< _Tp > >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06915.html',1,'std::owner_less< shared_ptr< _Tp > >']]], - ['owner_5fless_3c_20void_20_3e_509',['owner_less< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06911.html',1,'std']]], - ['owner_5fless_3c_20weak_5fptr_3c_20_5ftp_20_3e_20_3e_510',['owner_less< weak_ptr< _Tp > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09947.html',1,'std::experimental::fundamentals_v2::owner_less< weak_ptr< _Tp > >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06919.html',1,'std::owner_less< weak_ptr< _Tp > >']]], - ['owner_5fread_511',['owner_read',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a13804bd89bd86850b7c1b3cf17148c8b',1,'owner_read(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a13804bd89bd86850b7c1b3cf17148c8b',1,'owner_read(Global Namespace)']]], - ['owner_5fwrite_512',['owner_write',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a0d521a25ebf962a812b43c32fe36500e',1,'owner_write(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a0d521a25ebf962a812b43c32fe36500e',1,'owner_write(Global Namespace)']]] + ['object_10',['Object',['https://docs.opencv.org/4.2.0/de/d47/structcv_1_1datasets_1_1Object.html',1,'cv::datasets::Object'],['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#acf2c841a29a7ebda695fd90521c4781f',1,'cv::DetectionBasedTracker::Object']]], + ['object_11',['object',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_feature_homography.html',1,'Features2D + Homography to find a known object'],['https://docs.opencv.org/4.2.0/d4/d36/structcv_1_1dnn__objdetect_1_1object.html',1,'cv::dnn_objdetect::object'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9a4df356e05415438fadf8a15e583903.html#a9a4df356e05415438fadf8a15e583903',1,'nlohmann::basic_json::object()'],['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'Real Time pose estimation of a textured object']]], + ['object_20categorization_12',['Object Categorization',['https://docs.opencv.org/4.2.0/de/d24/group__features2d__category.html',1,'']]], + ['object_20classification_20and_20pose_20estimation_13',['CNN for 3D Object Classification and Pose Estimation',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'']]], + ['object_20detection_14',['Object Detection',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d9/d3f/group__cudaobjdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d9/de5/tutorial_py_table_of_contents_objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/dc/d73/tutorial_js_table_of_contents_objdetect.html',1,'Object Detection']]], + ['object_20detection_15',['object detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'DNN used for object detection'],['https://docs.opencv.org/4.2.0/d4/d54/group__xobjdetect.html',1,'Extended object detection']]], + ['object_20detection_20objdetect_20module_16',['Object Detection (objdetect module)',['https://docs.opencv.org/4.2.0/d2/d64/tutorial_table_of_content_objdetect.html',1,'']]], + ['object_20detection_20using_20cnns_17',['Object Detection using CNNs',['https://docs.opencv.org/4.2.0/d2/da2/tutorial_dnn_objdetect.html',1,'']]], + ['object_20recognition_18',['Object Recognition',['https://docs.opencv.org/4.2.0/dc/d24/group__datasets__or.html',1,'']]], + ['object_20recognition_20and_20pose_20estimation_20api_19',['3D object recognition and pose estimation API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'']]], + ['object_20tracking_20',['Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'Motion Analysis and Object Tracking'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html',1,'Object Tracking']]], + ['object_5fcomparator_5ft_21',['object_comparator_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac26c2e8d6bcaccde372ceedd81851200.html#ac26c2e8d6bcaccde372ceedd81851200',1,'nlohmann::basic_json']]], + ['object_5ffactory_2eh_22',['object_factory.h',['https://docs.opencv.org/4.2.0/de/d9f/object__factory_8h.html',1,'']]], + ['object_5fid_23',['object_id',['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#ae620ffdbf56387446d9734a8d0be361d',1,'cv::tbm::TrackedObject']]], + ['object_5ft_24',['object_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aef3ff5a73597850597d1d40db9edd376.html#aef3ff5a73597850597d1d40db9edd376',1,'nlohmann::basic_json']]], + ['objectdetection_25',['ObjectDetection',['https://docs.opencv.org/4.2.0/d7/de4/structcv_1_1dpm_1_1DPMDetector_1_1ObjectDetection.html',1,'cv::dpm::DPMDetector::ObjectDetection'],['https://docs.opencv.org/4.2.0/d7/de4/structcv_1_1dpm_1_1DPMDetector_1_1ObjectDetection.html#af28527ec9c3fb19f993b2203c55f6938',1,'cv::dpm::DPMDetector::ObjectDetection::ObjectDetection()'],['https://docs.opencv.org/4.2.0/d7/de4/structcv_1_1dpm_1_1DPMDetector_1_1ObjectDetection.html#a483e6b5702c759aa54441d5d8e410883',1,'cv::dpm::DPMDetector::ObjectDetection::ObjectDetection(const Rect &rect, float score, int classID=-1)']]], + ['objectness_26',['Objectness',['https://docs.opencv.org/4.2.0/d1/d82/classcv_1_1saliency_1_1Objectness.html',1,'cv::saliency']]], + ['objectnessbing_27',['ObjectnessBING',['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html',1,'cv::saliency::ObjectnessBING'],['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#a12e86bd3b4a931bc92741e6f41eca6b0',1,'cv::saliency::ObjectnessBING::ObjectnessBING()']]], + ['objects_28',['Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'Feature Matching + Homography to find Objects'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html',1,'Function Objects']]], + ['objects_29',['objects',['https://docs.opencv.org/4.2.0/dd/dd4/tutorial_detection_of_planar_objects.html',1,'Detection of planar objects'],['https://eigen.tuxfamily.org/dox/group__TopicFixedSizeVectorizable.html',1,'Fixed-size vectorizable Eigen objects'],['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html#a1386c7c7c3b5418f0f65a03b93cc5c65',1,'cv::MultiTracker::objects'],['https://docs.opencv.org/4.2.0/d0/db6/structcv_1_1datasets_1_1OR__pascalObj.html#aa11b281db769d93378c2a73968355811',1,'cv::datasets::OR_pascalObj::objects'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a18f9a78b9934e37ae8b8e6ea2a4b5f4d',1,'cv::tbm::Track::objects']]], + ['objects_20by_20value_20to_20functions_30',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], + ['objectstatus_31',['ObjectStatus',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ad43563cc5b954817ad5078f995afd3ff',1,'cv::DetectionBasedTracker']]], + ['objecttracks_32',['ObjectTracks',['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#a23e4438245cbbbab8e7baa38e491a924',1,'cv::tbm']]], + ['objpoints_33',['objPoints',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1aruco_1_1Board.html#ae7c2f21aa18add0211c360935e3f589b',1,'cv::aruco::Board']]], + ['obtainrefinedcameraparams_34',['obtainRefinedCameraParams',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#aae756bac56334dea76d4064c6a32c1a9',1,'cv::detail::BundleAdjusterBase']]], + ['occluded_35',['occluded',['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#a2e6b428365ee28627bc2f148934af48b',1,'cv::datasets::PascalObj']]], + ['occlusionsthreshold_36',['occlusionsThreshold',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#aa3939c091a999a323c42a01b547f8a36',1,'cv::optflow::OpticalFlowPCAFlow']]], + ['ocl_2ehpp_37',['ocl.hpp',['https://docs.opencv.org/4.2.0/da/d74/ocl_8hpp.html',1,'']]], + ['ocl_5fdefs_2ehpp_38',['ocl_defs.hpp',['https://docs.opencv.org/4.2.0/d1/d08/ocl__defs_8hpp.html',1,'']]], + ['ocl_5fgenbase_2ehpp_39',['ocl_genbase.hpp',['https://docs.opencv.org/4.2.0/d1/d1f/ocl__genbase_8hpp.html',1,'']]], + ['ocl_5fget_5fin_40',['ocl_get_in',['https://docs.opencv.org/4.2.0/d1/d1b/structcv_1_1detail_1_1ocl__get__in.html',1,'cv::detail']]], + ['ocl_5fget_5fin_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_41',['ocl_get_in< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/d7/d17/structcv_1_1detail_1_1ocl__get__in_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], + ['ocl_5fget_5fin_3c_20cv_3a_3agmat_20_3e_42',['ocl_get_in< cv::GMat >',['https://docs.opencv.org/4.2.0/d9/de2/structcv_1_1detail_1_1ocl__get__in_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], + ['ocl_5fget_5fin_3c_20cv_3a_3agscalar_20_3e_43',['ocl_get_in< cv::GScalar >',['https://docs.opencv.org/4.2.0/df/dbf/structcv_1_1detail_1_1ocl__get__in_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], + ['ocl_5fget_5fout_44',['ocl_get_out',['https://docs.opencv.org/4.2.0/d4/d3c/structcv_1_1detail_1_1ocl__get__out.html',1,'cv::detail']]], + ['ocl_5fget_5fout_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_45',['ocl_get_out< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/d2/d41/structcv_1_1detail_1_1ocl__get__out_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], + ['ocl_5fget_5fout_3c_20cv_3a_3agmat_20_3e_46',['ocl_get_out< cv::GMat >',['https://docs.opencv.org/4.2.0/d9/db3/structcv_1_1detail_1_1ocl__get__out_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], + ['ocl_5fget_5fout_3c_20cv_3a_3agscalar_20_3e_47',['ocl_get_out< cv::GScalar >',['https://docs.opencv.org/4.2.0/dd/dd4/structcv_1_1detail_1_1ocl__get__out_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], + ['ocl_5fvector_5fdefault_48',['OCL_VECTOR_DEFAULT',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ggae601ac868b72015b583ccbbdd0dec587a566f2a652ca8f26eabf5f6fc50faf59e',1,'cv::ocl::OCL_VECTOR_DEFAULT'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ggae601ac868b72015b583ccbbdd0dec587a566f2a652ca8f26eabf5f6fc50faf59e',1,'OCL_VECTOR_DEFAULT(Global Namespace)']]], + ['ocl_5fvector_5fmax_49',['OCL_VECTOR_MAX',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ggae601ac868b72015b583ccbbdd0dec587a3340448a36ad842065ad35c3586a754e',1,'cv::ocl::OCL_VECTOR_MAX'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ggae601ac868b72015b583ccbbdd0dec587a3340448a36ad842065ad35c3586a754e',1,'OCL_VECTOR_MAX(Global Namespace)']]], + ['ocl_5fvector_5fown_50',['OCL_VECTOR_OWN',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ggae601ac868b72015b583ccbbdd0dec587af4f3dacb8b06545e8e10cdc64d353ed6',1,'cv::ocl::OCL_VECTOR_OWN'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ggae601ac868b72015b583ccbbdd0dec587af4f3dacb8b06545e8e10cdc64d353ed6',1,'OCL_VECTOR_OWN(Global Namespace)']]], + ['oclcallhelper_51',['OCLCallHelper',['https://docs.opencv.org/4.2.0/df/d75/structcv_1_1detail_1_1OCLCallHelper.html',1,'cv::detail']]], + ['oclcallhelper_3c_20impl_2c_20k_3a_3ainargs_2c_20k_3a_3aoutargs_20_3e_52',['OCLCallHelper< Impl, K::InArgs, K::OutArgs >',['https://docs.opencv.org/4.2.0/df/d75/structcv_1_1detail_1_1OCLCallHelper.html',1,'']]], + ['oclcallhelper_3c_20impl_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20outs_2e_2e_2e_20_3e_20_3e_53',['OCLCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... > >',['https://docs.opencv.org/4.2.0/df/d06/structcv_1_1detail_1_1OCLCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_1tuple_3_01Outs_8_8_8_01_4_01_4.html',1,'cv::detail']]], + ['oclsvmdetector_54',['oclSvmDetector',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a42bb83b4d03a8ead9d54e8c5c8463076',1,'cv::HOGDescriptor']]], + ['oclvectorstrategy_55',['OclVectorStrategy',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gae601ac868b72015b583ccbbdd0dec587',1,'cv::ocl::OclVectorStrategy'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gae601ac868b72015b583ccbbdd0dec587',1,'OclVectorStrategy(Global Namespace)']]], + ['ocr_20of_20hand_20written_20data_20using_20knn_56',['OCR of Hand-written Data using kNN',['https://docs.opencv.org/4.2.0/d8/d4b/tutorial_py_knn_opencv.html',1,'']]], + ['ocr_20of_20hand_20written_20data_20using_20svm_57',['OCR of Hand-written Data using SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'']]], + ['ocr_2ehpp_58',['ocr.hpp',['https://docs.opencv.org/4.2.0/db/d5e/ocr_8hpp.html',1,'']]], + ['ocr_5fcnn_5fclassifier_59',['OCR_CNN_CLASSIFIER',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga688d3bbaf5a5ac19ffe9633d7dc0156aaf2248e60e9f6373cd7555a758a910262',1,'cv::text::OCR_CNN_CLASSIFIER'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga688d3bbaf5a5ac19ffe9633d7dc0156aaf2248e60e9f6373cd7555a758a910262',1,'OCR_CNN_CLASSIFIER(Global Namespace)']]], + ['ocr_5fdecoder_5fviterbi_60',['OCR_DECODER_VITERBI',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ggac013d7b1a6a1b7d739b89474c20ec086a9d8baffabe0834b3eacaf2e32a5c7fdd',1,'cv::text::OCR_DECODER_VITERBI'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ggac013d7b1a6a1b7d739b89474c20ec086a9d8baffabe0834b3eacaf2e32a5c7fdd',1,'OCR_DECODER_VITERBI(Global Namespace)']]], + ['ocr_5fengine_5fmode_61',['ocr_engine_mode',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga91c5c4396fea4192c6bf5a8b2eba871a',1,'cv::text::ocr_engine_mode'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga91c5c4396fea4192c6bf5a8b2eba871a',1,'ocr_engine_mode(Global Namespace)']]], + ['ocr_5fknn_5fclassifier_62',['OCR_KNN_CLASSIFIER',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga688d3bbaf5a5ac19ffe9633d7dc0156aafc76612bdc2a94f57f02bd25a6255f12',1,'cv::text::OCR_KNN_CLASSIFIER'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga688d3bbaf5a5ac19ffe9633d7dc0156aafc76612bdc2a94f57f02bd25a6255f12',1,'OCR_KNN_CLASSIFIER(Global Namespace)']]], + ['ocr_5flevel_5ftextline_63',['OCR_LEVEL_TEXTLINE',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga4393eddae65e48ed93934c409bd99126ae3afbc0d74dd08bf11ff430c59d75fa0',1,'cv::text::OCR_LEVEL_TEXTLINE'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga4393eddae65e48ed93934c409bd99126ae3afbc0d74dd08bf11ff430c59d75fa0',1,'OCR_LEVEL_TEXTLINE(Global Namespace)']]], + ['ocr_5flevel_5fword_64',['OCR_LEVEL_WORD',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga4393eddae65e48ed93934c409bd99126ab4582fb3843b8ad7e209bf8f212ac2fe',1,'cv::text::OCR_LEVEL_WORD'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga4393eddae65e48ed93934c409bd99126ab4582fb3843b8ad7e209bf8f212ac2fe',1,'OCR_LEVEL_WORD(Global Namespace)']]], + ['ocrbeamsearchdecoder_65',['OCRBeamSearchDecoder',['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html',1,'cv::text']]], + ['ocrhmmdecoder_66',['OCRHMMDecoder',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html',1,'cv::text']]], + ['ocrholisticwordrecognizer_67',['OCRHolisticWordRecognizer',['https://docs.opencv.org/4.2.0/d0/d8f/classcv_1_1text_1_1OCRHolisticWordRecognizer.html',1,'cv::text']]], + ['ocrtesseract_68',['OCRTesseract',['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html',1,'cv::text']]], + ['oct_69',['oct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'basic_ios< char, _Traits >::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'basic_iostream< char >::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'basic_istream< char >::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'basic_istream< char, _Traits >::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'basic_ostream< char >::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'basic_ostream< char, _Traits >::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_fstream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_ifstream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_ios::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_iostream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_istream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_istringstream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_ofstream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_ostream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_ostringstream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::basic_stringstream::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab9d72ba493c0a12da9e6669c32af98ed',1,'std::ios_base::oct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5fa596d5be9b0fbcf9d9c18b6ed1fe0e',1,'std::oct()']]], + ['octave_70',['octave',['https://docs.opencv.org/4.2.0/d9/daa/structcvhalKeyPoint.html#a4126383574309a7acd431209ae018012',1,'cvhalKeyPoint::octave'],['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#acd62d95914b8005ee4f425c171c2ed1f',1,'cv::line_descriptor::KeyLine::octave'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#aee152750aa98ea54a48196a937197095',1,'cv::KeyPoint::octave']]], + ['octave_5frow_71',['OCTAVE_ROW',['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#a7e4860752f540f81c3674f6efb2c26a3',1,'cv::cuda::ORB::OCTAVE_ROW'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a3b5156553e52661b04bf02fa9628f746a55792ce8877b0fcac85cf25f9ff4882d',1,'cv::cuda::SURF_CUDA::OCTAVE_ROW']]], + ['ocvcallhelper_72',['OCVCallHelper',['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1detail_1_1OCVCallHelper.html',1,'cv::detail']]], + ['ocvcallhelper_3c_20impl_2c_20k_3a_3ainargs_2c_20k_3a_3aoutargs_20_3e_73',['OCVCallHelper< Impl, K::InArgs, K::OutArgs >',['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1detail_1_1OCVCallHelper.html',1,'']]], + ['ocvcallhelper_3c_20impl_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20outs_2e_2e_2e_20_3e_20_3e_74',['OCVCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... > >',['https://docs.opencv.org/4.2.0/da/d5a/structcv_1_1detail_1_1OCVCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_1tuple_3_01Outs_8_8_8_01_4_01_4.html',1,'cv::detail']]], + ['odometry_75',['Odometry',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html',1,'cv::rgbd']]], + ['odometryframe_76',['OdometryFrame',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html',1,'cv::rgbd::OdometryFrame'],['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#aed035e8521f0a32dce451b69ca0bafcd',1,'cv::rgbd::OdometryFrame::OdometryFrame()'],['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#adc3944a88f204c37dcf2ab3615b223b3',1,'cv::rgbd::OdometryFrame::OdometryFrame(const Mat &image, const Mat &depth, const Mat &mask=Mat(), const Mat &normals=Mat(), int ID=-1)']]], + ['oem_5fcube_5fonly_77',['OEM_CUBE_ONLY',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa42027b630054154cd8263f6a70f58ec3',1,'cv::text::OEM_CUBE_ONLY'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa42027b630054154cd8263f6a70f58ec3',1,'OEM_CUBE_ONLY(Global Namespace)']]], + ['oem_5fdefault_78',['OEM_DEFAULT',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa8323b4ed6d93e0dd6b2656dd4eaa11c3',1,'cv::text::OEM_DEFAULT'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa8323b4ed6d93e0dd6b2656dd4eaa11c3',1,'OEM_DEFAULT(Global Namespace)']]], + ['oem_5ftesseract_5fcube_5fcombined_79',['OEM_TESSERACT_CUBE_COMBINED',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa12cb4b814e595a715a93ddca68d07787',1,'cv::text::OEM_TESSERACT_CUBE_COMBINED'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa12cb4b814e595a715a93ddca68d07787',1,'OEM_TESSERACT_CUBE_COMBINED(Global Namespace)']]], + ['oem_5ftesseract_5fonly_80',['OEM_TESSERACT_ONLY',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa308fc26cecf758c6d7f4d503f9c9d5a2',1,'cv::text::OEM_TESSERACT_ONLY'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga91c5c4396fea4192c6bf5a8b2eba871aa308fc26cecf758c6d7f4d503f9c9d5a2',1,'OEM_TESSERACT_ONLY(Global Namespace)']]], + ['of_20a_20textured_20object_81',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], + ['of_20a_20widget_82',['Pose of a widget',['https://docs.opencv.org/4.2.0/d8/df0/tutorial_widget_pose.html',1,'']]], + ['of_20an_20image_83',['Changing the contrast and brightness of an image!',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'']]], + ['of_20any_20type_84',['Type-safe container of any type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html',1,'']]], + ['of_20aruco_20boards_85',['Detection of ArUco Boards',['https://docs.opencv.org/4.2.0/db/da9/tutorial_aruco_board_detection.html',1,'']]], + ['of_20aruco_20markers_86',['Detection of ArUco Markers',['https://docs.opencv.org/4.2.0/d5/dae/tutorial_aruco_detection.html',1,'']]], + ['of_20charuco_20corners_87',['Detection of ChArUco Corners',['https://docs.opencv.org/4.2.0/df/d4a/tutorial_charuco_detection.html',1,'']]], + ['of_20coefficient_20wise_20math_20functions_88',['Catalog of coefficient-wise math functions',['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'']]], + ['of_20computer_20vision_20applications_89',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], + ['of_20computer_20vision_20programs_90',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], + ['of_20dense_20decompositions_91',['of dense decompositions',['https://eigen.tuxfamily.org/dox/group__DenseDecompositionBenchmark.html',1,'Benchmark of dense decompositions'],['https://eigen.tuxfamily.org/dox/group__TopicLinearAlgebraDecompositions.html',1,'Catalogue of dense decompositions']]], + ['of_20diamond_20markers_92',['Detection of Diamond Markers',['https://docs.opencv.org/4.2.0/d5/d07/tutorial_charuco_diamond_detection.html',1,'']]], + ['of_20different_20image_20hashing_20algorithms_93',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], + ['of_20eigen_94',['Experimental parts of Eigen',['https://eigen.tuxfamily.org/dox/Experimental.html',1,'']]], + ['of_20focus_20deblur_20filter_95',['Out-of-focus Deblur Filter',['https://docs.opencv.org/4.2.0/de/d3c/tutorial_out_of_focus_deblur_filter.html',1,'']]], + ['of_20hand_20written_20data_20using_20knn_96',['OCR of Hand-written Data using kNN',['https://docs.opencv.org/4.2.0/d8/d4b/tutorial_py_knn_opencv.html',1,'']]], + ['of_20hand_20written_20data_20using_20svm_97',['OCR of Hand-written Data using SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'']]], + ['of_20images_98',['of Images',['https://docs.opencv.org/4.2.0/da/d6e/tutorial_py_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dd/d52/tutorial_js_geometric_transformations.html',1,'Geometric Transformations of Images']]], + ['of_20implemented_20layers_99',['Partial List of Implemented Layers',['https://docs.opencv.org/4.2.0/d6/d87/group__dnnLayerList.html',1,'']]], + ['of_20keypoints_20and_20matches_100',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], + ['of_20planar_20objects_101',['Detection of planar objects',['https://docs.opencv.org/4.2.0/dd/dd4/tutorial_detection_of_planar_objects.html',1,'']]], + ['of_20the_20assertion_20on_20unaligned_20arrays_102',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], + ['of_20the_20homography_20explained_20with_20code_103',['Basic concepts of the homography explained with code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'']]], + ['off_5ftype_104',['off_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a9b0940b8e61b43dbb5c0f1bb268ce944',1,'basic_ios< char, _Traits >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a9b0940b8e61b43dbb5c0f1bb268ce944',1,'basic_ios< char, _Traits >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'basic_streambuf< _Elem, _Tr >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'basic_streambuf< _Elem, _Tr >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'basic_streambuf< char, _Traits >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'basic_streambuf< char, _Traits >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'basic_streambuf< char, char_traits< char > >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'basic_streambuf< char, char_traits< char > >::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a9b0940b8e61b43dbb5c0f1bb268ce944',1,'std::basic_ios::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a9b0940b8e61b43dbb5c0f1bb268ce944',1,'std::basic_ios::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'std::basic_streambuf::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'std::basic_streambuf::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'std::wbuffer_convert::off_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae0d813da6c3d39659299a6e7831ae265',1,'std::wbuffer_convert::off_type']]], + ['offset_105',['offset',['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aefd8bc792218830014d8a99357acefa3',1,'cv::UMat::offset'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a65071abdc2def57324376f3f56cac370',1,'cv::_InputArray::offset()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a4a9fae414234e9513194b69a878a4225',1,'Eigen::Hyperplane::offset()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a7451d5993c7b87e2ff358e0aa3a06175',1,'Eigen::Hyperplane::offset() const']]], + ['ofs_106',['ofs',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a824f3fd3cd0f3a3be9cecc66ceb32065',1,'cv::FileNode::ofs'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a231c0c7d30c035d1ac9536c59fb018b8',1,'cv::FileNodeIterator::ofs'],['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#a5b35b2b2ed439cc747eeae85bb0228ee',1,'cv::datasets::HPE_humanevaObj::ofs']]], + ['ofstream_107',['ofstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga7a439605cbbc7d72fcefc9d6a59c4f0a',1,'std::ofstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga7a439605cbbc7d72fcefc9d6a59c4f0a',1,'ofstream(Global Namespace)']]], + ['ogre_203d_20visualiser_108',['OGRE 3D Visualiser',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html',1,'']]], + ['oil_20painting_20effect_109',['Oil painting effect',['https://docs.opencv.org/4.2.0/dd/d8c/tutorial_xphoto_oil_painting_effect.html',1,'']]], + ['oil_5fpainting_5feffect_2emarkdown_110',['oil_painting_effect.markdown',['https://docs.opencv.org/4.2.0/d4/d7d/oil__painting__effect_8markdown.html',1,'']]], + ['oilpainting_111',['oilPainting',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac050a6e876298cb9713cd2c09db9a027',1,'cv::xphoto::oilPainting(InputArray src, OutputArray dst, int size, int dynRatio, int code)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac18ef93a7b1e65f703f7dc3b1e8e5235',1,'cv::xphoto::oilPainting(InputArray src, OutputArray dst, int size, int dynRatio)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac050a6e876298cb9713cd2c09db9a027',1,'oilPainting(InputArray src, OutputArray dst, int size, int dynRatio, int code)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac18ef93a7b1e65f703f7dc3b1e8e5235',1,'oilPainting(InputArray src, OutputArray dst, int size, int dynRatio)(Global Namespace)']]], + ['oilpainting_2ehpp_112',['oilpainting.hpp',['https://docs.opencv.org/4.2.0/dc/d56/oilpainting_8hpp.html',1,'']]], + ['ok_113',['OK',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a507409ce9435dd89857469d12ec06b45afc04343b65c6780b62b684ed14e26586',1,'cv::Stitcher']]], + ['olive_114',['olive',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a46c5e1634ff57241cdceda2546520a8a',1,'cv::viz::Color']]], + ['omnidir_2ehpp_115',['omnidir.hpp',['https://docs.opencv.org/4.2.0/db/d62/omnidir_8hpp.html',1,'']]], + ['omnidir_5ftutorial_2emarkdown_116',['omnidir_tutorial.markdown',['https://docs.opencv.org/4.2.0/dc/d3a/omnidir__tutorial_8markdown.html',1,'']]], + ['omnidirectional_117',['OMNIDIRECTIONAL',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#ab2a2522a8e0bf60ee24416e0ec37ba3ea36e58b4ea6bf200b89ca9536783c5dbc',1,'cv::multicalib::MultiCameraCalibration']]], + ['omnidirectional_20cameara_20calibration_118',['Omnidirectional Cameara Calibration',['https://docs.opencv.org/4.2.0/dd/d12/tutorial_omnidir_calib_main.html',1,'']]], + ['omp_5floop_2eh_119',['omp_loop.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00932.html',1,'']]], + ['omp_5floop_5fstatic_2eh_120',['omp_loop_static.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00935.html',1,'']]], + ['omp_5floop_5fstatic_5ftag_121',['omp_loop_static_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09727.html',1,'__gnu_parallel']]], + ['omp_5floop_5ftag_122',['omp_loop_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09723.html',1,'__gnu_parallel']]], + ['on_123',['on',['https://docs.opencv.org/4.2.0/df/d7c/classcv_1_1GKernelType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a22b2b5fd61dd5989e0b283d1874bc39b',1,'cv::GKernelType< K, std::function< R(Args...)> >::on()'],['https://docs.opencv.org/4.2.0/dc/d2d/classcv_1_1GKernelTypeM_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#ab5e3c7ebaad0127424a14bddf068caf0',1,'cv::GKernelTypeM< K, std::function< std::tuple< R... >(Args...)> >::on()']]], + ['on_20a_20simple_20example_124',['What happens inside Eigen, on a simple example',['https://eigen.tuxfamily.org/dox/TopicInsideEigenExample.html',1,'']]], + ['on_20android_20device_125',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], + ['on_20arrays_126',['Operations on arrays',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html',1,'']]], + ['on_20facial_20landmark_20detector_20api_127',['Tutorial on Facial Landmark Detector API',['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'']]], + ['on_20fuzzy_20mathematics_128',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], + ['on_20g_20api_129',['Porting anisotropic image segmentation on G-API',['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'']]], + ['on_20images_130',['on Images',['https://docs.opencv.org/4.2.0/d0/d86/tutorial_py_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/d3/df2/tutorial_py_basic_ops.html',1,'Basic Operations on Images'],['https://docs.opencv.org/4.2.0/de/d06/tutorial_js_basic_ops.html',1,'Basic Operations on Images']]], + ['on_20matrices_131',['on Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'Arithm Operations on Matrices'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'Core Operations on Matrices'],['https://docs.opencv.org/4.2.0/d5/d8e/group__cudaarithm.html',1,'Operations on Matrices']]], + ['on_20matrices_132',['on matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'Graph API: Operations on matrices'],['https://docs.opencv.org/4.2.0/d7/d37/tutorial_mat_mask_operations.html',1,'Mask operations on matrices']]], + ['on_20run_20length_20encoded_20image_133',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], + ['on_20stack_20alignment_134',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], + ['on_20the_20gpu_135',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], + ['on_20unaligned_20arrays_136',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], + ['onbeginframe_137',['onBeginFrame',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1cudacodec_1_1EncoderCallBack.html#a277162f0366d3d8caae0a51adcefc8fc',1,'cv::cudacodec::EncoderCallBack']]], + ['once_5fflag_138',['once_flag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02635.html',1,'std::once_flag'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02635.html#a78b964b5391b5aa7da309eb3d8b88178',1,'std::once_flag::once_flag() noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02635.html#a60da2be389d0324a5210bd778a522af8',1,'std::once_flag::once_flag(const once_flag &)=delete']]], + ['one_139',['one',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga87203f2a67ddb911cc8cbb8984a8c7e6',1,'cv::softdouble::one()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga214e54c7bf87163f778fc5212c0c92f5',1,'cv::softfloat::one()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga214e54c7bf87163f778fc5212c0c92f5',1,'one()(Global Namespace)']]], + ['one_20color_20space_20to_20another_140',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], + ['one_5fclass_141',['ONE_CLASS',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa6951543a0c14a17a7e16d212b1e7dcaf',1,'cv::ml::SVM']]], + ['one_5fstep_142',['ONE_STEP',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#gga6a4ee3a5f9fd35c1b350a1049d8abc9dae6619bf12f07b1ec1f249341568fd56d',1,'cv::ft::ONE_STEP'],['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#gga6a4ee3a5f9fd35c1b350a1049d8abc9dae6619bf12f07b1ec1f249341568fd56d',1,'ONE_STEP(Global Namespace)']]], + ['onendframe_143',['onEndFrame',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1cudacodec_1_1EncoderCallBack.html#ac663a41e183e1c482b7eef6054bfae23',1,'cv::cudacodec::EncoderCallBack']]], + ['onepassstabilizer_144',['OnePassStabilizer',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html',1,'cv::videostab::OnePassStabilizer'],['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#a127cccfe617f6909764fdf5de436c85f',1,'cv::videostab::OnePassStabilizer::OnePassStabilizer()']]], + ['ones_145',['Ones',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2755cb4023f7376880523626a8e05101',1,'Eigen::DenseBase::Ones()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8b2a51018a73a766f5b91aef3487f013',1,'Eigen::DenseBase::Ones(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab710a58e4a80fbcb2594242372c8fe56',1,'Eigen::DenseBase::Ones(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2755cb4023f7376880523626a8e05101',1,'DenseBase< ArrayWrapper< ExpressionType > >::Ones()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8b2a51018a73a766f5b91aef3487f013',1,'DenseBase< ArrayWrapper< ExpressionType > >::Ones(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab710a58e4a80fbcb2594242372c8fe56',1,'DenseBase< ArrayWrapper< ExpressionType > >::Ones(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2755cb4023f7376880523626a8e05101',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Ones()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8b2a51018a73a766f5b91aef3487f013',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Ones(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab710a58e4a80fbcb2594242372c8fe56',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Ones(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2755cb4023f7376880523626a8e05101',1,'DenseBase< Solve< Decomposition, RhsType > >::Ones()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8b2a51018a73a766f5b91aef3487f013',1,'DenseBase< Solve< Decomposition, RhsType > >::Ones(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab710a58e4a80fbcb2594242372c8fe56',1,'DenseBase< Solve< Decomposition, RhsType > >::Ones(Index size)']]], + ['ones_146',['ones',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a69ae0402d116fc9c71908d8508dc2f09',1,'cv::Mat::ones(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#afc9c2c0b17ecd00932bc5fbc72f9bce0',1,'cv::Mat::ones(Size size, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a6ed33f15d7bf0172efb62d61b3751284',1,'cv::Mat::ones(int ndims, const int *sz, int type)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a32a2d59f84562e2357176352cfa4b66b',1,'cv::Mat_::ones(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a962c5ba7d1dda84c10c537295b1ff4e8',1,'cv::Mat_::ones(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3fe588491bfb97cce6c747d72f4ed27d',1,'cv::Mat_::ones(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a32a2d59f84562e2357176352cfa4b66b',1,'Mat_< double >::ones(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a962c5ba7d1dda84c10c537295b1ff4e8',1,'Mat_< double >::ones(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3fe588491bfb97cce6c747d72f4ed27d',1,'Mat_< double >::ones(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a32a2d59f84562e2357176352cfa4b66b',1,'Mat_< float >::ones(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a962c5ba7d1dda84c10c537295b1ff4e8',1,'Mat_< float >::ones(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3fe588491bfb97cce6c747d72f4ed27d',1,'Mat_< float >::ones(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a32a2d59f84562e2357176352cfa4b66b',1,'Mat_< uchar >::ones(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a962c5ba7d1dda84c10c537295b1ff4e8',1,'Mat_< uchar >::ones(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3fe588491bfb97cce6c747d72f4ed27d',1,'Mat_< uchar >::ones(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a32a2d59f84562e2357176352cfa4b66b',1,'Mat_< unsigned char >::ones(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a962c5ba7d1dda84c10c537295b1ff4e8',1,'Mat_< unsigned char >::ones(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3fe588491bfb97cce6c747d72f4ed27d',1,'Mat_< unsigned char >::ones(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'cv::Matx::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< _Tp, cn, 1 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, 1, 3 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, 2, 2 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, 2, 3 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, 3, 3 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, 3, 4 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, 4, 4 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< double, cn, 1 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< float, 2, 3 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< float, 3, 3 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< float, cn, 1 >::ones()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0eb0a502e5ac9c4511e953e78a45ed19',1,'Matx< float_type, 4, 4 >::ones()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#adf78401deb21d2b46144db979a86a296',1,'cv::UMat::ones(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a85f38b108c177ed5696aa4295f45ea4e',1,'cv::UMat::ones(Size size, int type)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ae6f92d67658151a00723abdbabe572b8',1,'cv::UMat::ones(int ndims, const int *sz, int type)']]], + ['onlineboosting_2ehpp_147',['onlineBoosting.hpp',['https://docs.opencv.org/4.2.0/d9/dd7/onlineBoosting_8hpp.html',1,'']]], + ['onlinemil_2ehpp_148',['onlineMIL.hpp',['https://docs.opencv.org/4.2.0/de/d5c/onlineMIL_8hpp.html',1,'']]], + ['ontheleft_149',['OnTheLeft',['https://eigen.tuxfamily.org/dox/group__enums.html#ggac22de43beeac7a78b384f99bed5cee0ba21b30a61e9cb10c967aec17567804007',1,'Eigen::OnTheLeft'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggac22de43beeac7a78b384f99bed5cee0ba21b30a61e9cb10c967aec17567804007',1,'OnTheLeft(Global Namespace)']]], + ['ontheright_150',['OnTheRight',['https://eigen.tuxfamily.org/dox/group__enums.html#ggac22de43beeac7a78b384f99bed5cee0ba329fc3a54ceb2b6e0e73b400998b8a82',1,'Eigen::OnTheRight'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggac22de43beeac7a78b384f99bed5cee0ba329fc3a54ceb2b6e0e73b400998b8a82',1,'OnTheRight(Global Namespace)']]], + ['op_151',['op',['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#ad8e79acfd982f0647959ecdff2400508',1,'cv::cudev::BinaryTransformPtr::op'],['https://docs.opencv.org/4.2.0/dc/da3/structcv_1_1cudev_1_1BinaryTupleAdapter.html#a088973d5582ea710c8da3943c4b5d185',1,'cv::cudev::BinaryTupleAdapter::op'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1Binder1st.html#a19e90d48e23e9a6db12ab942b7622e67',1,'cv::cudev::Binder1st::op'],['https://docs.opencv.org/4.2.0/d6/db4/structcv_1_1cudev_1_1Binder2nd.html#a5c9916f5e382734185f9abbb34d6b31f',1,'cv::cudev::Binder2nd::op'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a98f8a4a0853cb5ac6b147238f3d4ad1f',1,'cv::MatExpr::op'],['https://docs.opencv.org/4.2.0/dd/d01/structcv_1_1cudev_1_1UnaryTransformPtr.html#ac22a69fee93f1ae30e2307766432f7ec',1,'cv::cudev::UnaryTransformPtr::op'],['https://docs.opencv.org/4.2.0/d4/d57/structcv_1_1cudev_1_1UnaryTupleAdapter.html#a06a4e7b5e8ae9bc5e39eef69ff2d6489',1,'cv::cudev::UnaryTupleAdapter::op']]], + ['opacity_152',['OPACITY',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acadf29e51a4d564723ffac7ae2eaf2ccab',1,'cv::viz::OPACITY'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acadf29e51a4d564723ffac7ae2eaf2ccab',1,'OPACITY(Global Namespace)']]], + ['opaque_153',['opaque',['https://docs.opencv.org/4.2.0/de/d30/structcv_1_1GKernelImpl.html#a8bad17cf833d8a3fd75db96c4b42647a',1,'cv::GKernelImpl']]], + ['open_154',['open',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a14c2c18dc2e29999d03d52a0c24bd91c',1,'cv::FileStorage::open()'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a614a1702e15f42ede5100014ce7f48ed',1,'cv::VideoCapture::open(const String &filename, int apiPreference=CAP_ANY)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a49e87ea8665f471b76a48c0a6c537fb7',1,'cv::VideoCapture::open(int index, int apiPreference=CAP_ANY)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a0901c353cd5ea05bba455317dab81130',1,'cv::VideoWriter::open(const String &filename, int fourcc, double fps, Size frameSize, bool isColor=true)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a808ee7d60c58af071035a19e396bfa91',1,'cv::VideoWriter::open(const String &filename, int apiPreference, int fourcc, double fps, Size frameSize, bool isColor=true)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#ad72dc61561f4420b36f9e626b4426433',1,'__gnu_cxx::enc_filebuf::open(const char *__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a541062313b01b7bb74af2582f88a365f',1,'__gnu_cxx::enc_filebuf::open(const std::string &__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#ad72dc61561f4420b36f9e626b4426433',1,'__gnu_cxx::stdio_filebuf::open(const char *__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a541062313b01b7bb74af2582f88a365f',1,'__gnu_cxx::stdio_filebuf::open(const std::string &__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#ad72dc61561f4420b36f9e626b4426433',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::open(const char *__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a541062313b01b7bb74af2582f88a365f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::open(const std::string &__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#ad72dc61561f4420b36f9e626b4426433',1,'basic_filebuf< char_type, traits_type >::open(const char *__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a541062313b01b7bb74af2582f88a365f',1,'basic_filebuf< char_type, traits_type >::open(const std::string &__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#ad72dc61561f4420b36f9e626b4426433',1,'std::basic_filebuf::open(const char *__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a541062313b01b7bb74af2582f88a365f',1,'std::basic_filebuf::open(const std::string &__s, ios_base::openmode __mode)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02079.html#a3a4c04e09a683bc30e9c5c19bdbbcda4',1,'std::basic_fstream::open(const char *__s, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02079.html#a4e3a98b2a30cf6f0e3eaff8eeb9eee47',1,'std::basic_fstream::open(const std::string &__s, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02071.html#a642496a04b7adb81e614d2b3903734ff',1,'std::basic_ifstream::open(const char *__s, ios_base::openmode __mode=ios_base::in)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02071.html#ab7c7c2bf6e27152bb0460c83c32ab431',1,'std::basic_ifstream::open(const std::string &__s, ios_base::openmode __mode=ios_base::in)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02075.html#a81f26964cd5c6cc8d3e833735f606646',1,'std::basic_ofstream::open(const char *__s, ios_base::openmode __mode=ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02075.html#a3da82e8f108d33a7e5de244695d2a28b',1,'std::basic_ofstream::open(const std::string &__s, ios_base::openmode __mode=ios_base::out)'],['../classcam_1_1Camera.html#a42a4cb744e4fd07387c7a6dedd99b45b',1,'cam::Camera::open(std::string filename, CameraParams intrinsic_params=CameraParams(), cv::Mat extrinsic_params=cv::Mat())'],['../classcam_1_1Camera.html#a8829ed566f7b6c891f2e29d568705189',1,'cam::Camera::open(int camera_id, CameraParams intrinsic_params=CameraParams(), cv::Mat extrinsic_params=cv::Mat())'],['https://docs.opencv.org/4.2.0/d6/dee/group__hdf5.html#ga243d7e303690af3c5c3686ca5785205e',1,'cv::hdf::open()'],['https://docs.opencv.org/4.2.0/d6/dee/group__hdf5.html#ga243d7e303690af3c5c3686ca5785205e',1,'open()(Global Namespace)']]], + ['open_5fcamera_155',['OPEN_CAMERA',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html#gga5291115322efc2f86c7551ab37ab6554a0138ded351ab41c87d216bf128bcc1b7',1,'cv::OPEN_CAMERA'],['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html#gga5291115322efc2f86c7551ab37ab6554a0138ded351ab41c87d216bf128bcc1b7',1,'OPEN_CAMERA(Global Namespace)']]], + ['opencl_20cl_20va_20interoperability_156',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], + ['opencl_20in_20android_20camera_20preview_20based_20cv_20application_157',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], + ['opencl_20support_158',['OpenCL support',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html',1,'']]], + ['opencl_5fc_5fversion_159',['OpenCL_C_Version',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2e227e1779bef769064ca0c436cc10af',1,'cv::ocl::Device']]], + ['opencl_5finfo_2ehpp_160',['opencl_info.hpp',['https://docs.opencv.org/4.2.0/d6/d54/opencl__info_8hpp.html',1,'']]], + ['opencl_5fsvm_2ehpp_161',['opencl_svm.hpp',['https://docs.opencv.org/4.2.0/df/d48/opencl__svm_8hpp.html',1,'']]], + ['openclapicallerror_162',['OpenCLApiCallError',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa9bef3bdb9825b3eb17f43e20980bd651',1,'cv::Error']]], + ['opencldoublenotsupported_163',['OpenCLDoubleNotSupported',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa1968883aa9ea7c47509d657bf802aea5',1,'cv::Error']]], + ['opencliniterror_164',['OpenCLInitError',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa4c2ce87013f9b175a293ff2f0bcbc00f',1,'cv::Error']]], + ['openclnoamdblasfft_165',['OpenCLNoAMDBlasFft',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa5d99510b10d71eadc2e42f19f4d8c088',1,'cv::Error']]], + ['openclversion_166',['OpenCLVersion',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ac882a36c0b1a7eebeebae6530a0c1c6e',1,'cv::ocl::Device']]], + ['opencv_167',['OpenCV',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_adding_images.html',1,'Adding (blending) two images using OpenCV'],['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'Android Development with OpenCV'],['https://docs.opencv.org/4.2.0/d4/d94/tutorial_camera_calibration.html',1,'Camera calibration With OpenCV'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html',1,'ColorMaps in OpenCV'],['https://docs.opencv.org/4.2.0/d3/d05/tutorial_py_table_of_contents_contours.html',1,'Contours in OpenCV'],['https://docs.opencv.org/4.2.0/d7/d9e/tutorial_video_write.html',1,'Creating a video with OpenCV'],['https://docs.opencv.org/4.2.0/dc/da5/tutorial_py_drawing_functions.html',1,'Drawing Functions in OpenCV'],['https://docs.opencv.org/4.2.0/da/d60/tutorial_face_main.html',1,'Face Recognition with OpenCV'],['https://docs.opencv.org/4.2.0/dc/d4d/tutorial_py_table_of_contents_gui.html',1,'Gui Features in OpenCV'],['https://docs.opencv.org/4.2.0/de/db2/tutorial_py_table_of_contents_histograms.html',1,'Histograms in OpenCV'],['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'How to scan images, lookup tables and time measurement with OpenCV'],['https://docs.opencv.org/4.2.0/d2/d96/tutorial_py_table_of_contents_imgproc.html',1,'Image Processing in OpenCV'],['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'Image Transforms in OpenCV'],['https://docs.opencv.org/4.2.0/df/d65/tutorial_table_of_content_introduction.html',1,'Introduction to OpenCV'],['https://docs.opencv.org/4.2.0/da/df6/tutorial_py_table_of_contents_setup.html',1,'Introduction to OpenCV'],['https://docs.opencv.org/4.2.0/d1/d5c/tutorial_py_kmeans_opencv.html',1,'K-Means Clustering in OpenCV'],['https://docs.opencv.org/4.2.0/df/d61/tutorial_random_generator_and_text.html',1,'Random generator and text with OpenCV'],['https://docs.opencv.org/4.2.0/d4/db1/tutorial_documentation.html',1,'Writing documentation for OpenCV']]], + ['opencv_20and_20similarity_20measurement_168',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], + ['opencv_20development_20with_20clojure_169',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], + ['opencv_20for_20tegra_20with_20cuda_170',['Building OpenCV for Tegra with CUDA',['https://docs.opencv.org/4.2.0/d6/d15/tutorial_building_tegra_cuda.html',1,'']]], + ['opencv_20from_20other_20doxygen_20projects_171',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], + ['opencv_20inside_20the_20microsoft_20visual_20studio_172',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['opencv_20ios_173',['OpenCV iOS',['https://docs.opencv.org/4.2.0/d3/dc9/tutorial_table_of_content_ios.html',1,'']]], + ['opencv_20ios_20hello_174',['OpenCV iOS Hello',['https://docs.opencv.org/4.2.0/d7/d88/tutorial_hello.html',1,'']]], + ['opencv_20ios_20image_20processing_175',['OpenCV iOS - Image Processing',['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'']]], + ['opencv_20ios_20video_20processing_176',['OpenCV iOS - Video Processing',['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'']]], + ['opencv_20java_20with_20eclipse_177',['Using OpenCV Java with Eclipse',['https://docs.opencv.org/4.2.0/d1/d0a/tutorial_java_eclipse.html',1,'']]], + ['opencv_20js_178',['OpenCV js',['https://docs.opencv.org/4.2.0/d4/da1/tutorial_js_setup.html',1,'Build OpenCV.js'],['https://docs.opencv.org/4.2.0/d0/d43/tutorial_js_table_of_contents_contours.html',1,'Contours in OpenCV.js'],['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'Histograms in OpenCV.js'],['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'Image Transforms in OpenCV.js'],['https://docs.opencv.org/4.2.0/df/df7/tutorial_js_table_of_contents_setup.html',1,'Introduction to OpenCV.js'],['https://docs.opencv.org/4.2.0/d0/d84/tutorial_js_usage.html',1,'Using OpenCV.js']]], + ['opencv_20js_20and_20tutorials_179',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], + ['opencv_20js_20in_20node_20js_180',['Using OpenCV.js In Node.js',['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'']]], + ['opencv_20js_20tutorials_181',['OpenCV.js Tutorials',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_js_root.html',1,'']]], + ['opencv_20overview_182',['Video I/O with OpenCV Overview',['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'']]], + ['opencv_20parallel_5ffor_5f_20to_20parallelize_20your_20code_183',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], + ['opencv_20python_20bindings_184',['OpenCV-Python Bindings',['https://docs.opencv.org/4.2.0/df/da2/tutorial_py_table_of_contents_bindings.html',1,'']]], + ['opencv_20python_20bindings_20works_185',['How OpenCV-Python Bindings Works?',['https://docs.opencv.org/4.2.0/da/d49/tutorial_py_bindings_basics.html',1,'']]], + ['opencv_20python_20in_20fedora_186',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], + ['opencv_20python_20in_20ubuntu_187',['Install OpenCV-Python in Ubuntu',['https://docs.opencv.org/4.2.0/d2/de6/tutorial_py_setup_in_ubuntu.html',1,'']]], + ['opencv_20python_20in_20windows_188',['Install OpenCV-Python in Windows',['https://docs.opencv.org/4.2.0/d5/de5/tutorial_py_setup_in_windows.html',1,'']]], + ['opencv_20python_20tutorials_189',['OpenCV Python Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'Introduction to OpenCV-Python Tutorials'],['https://docs.opencv.org/4.2.0/d6/d00/tutorial_py_root.html',1,'OpenCV-Python Tutorials']]], + ['opencv_20samples_190',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]], + ['opencv_20tracker_191',['Introduction to OpenCV Tracker',['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'']]], + ['opencv_20tutorials_192',['OpenCV Tutorials',['https://docs.opencv.org/4.2.0/d9/df8/tutorial_root.html',1,'']]], + ['opencv_20viz_193',['OpenCV Viz',['https://docs.opencv.org/4.2.0/d7/df9/tutorial_table_of_content_viz.html',1,'']]], + ['opencv_20with_20eclipse_20plugin_20cdt_194',['Using OpenCV with Eclipse (plugin CDT)',['https://docs.opencv.org/4.2.0/d7/d16/tutorial_linux_eclipse.html',1,'']]], + ['opencv_20with_20gcc_20and_20cmake_195',['Using OpenCV with gcc and CMake',['https://docs.opencv.org/4.2.0/db/df5/tutorial_linux_gcc_cmake.html',1,'']]], + ['opencv4android_20sdk_196',['OpenCV4Android SDK',['https://docs.opencv.org/4.2.0/da/d2a/tutorial_O4A_SDK.html',1,'']]], + ['opencv_5fapi_5fheader_197',['OpenCV_API_Header',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html',1,'']]], + ['opencv_5fincludes_2ehpp_198',['opencv_includes.hpp',['https://docs.opencv.org/4.2.0/dc/d17/opencv__includes_8hpp.html',1,'']]], + ['opencv_5fversion_5fmajor_199',['opencv_version_major',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#aea2d7d3aee5b524576faf6fa824530ae',1,'OpenCV_API_Header']]], + ['opencv_5fversion_5fminor_200',['opencv_version_minor',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#a6cb67df066743a77434869554bb44587',1,'OpenCV_API_Header']]], + ['opencv_5fversion_5fpatch_201',['opencv_version_patch',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#aeb1c3169a88e1286e9464b22317fc707',1,'OpenCV_API_Header']]], + ['opencv_5fversion_5fstatus_202',['opencv_version_status',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#ae05496ecef5bfc87460a7d4f5779806b',1,'OpenCV_API_Header']]], + ['openfromconfigfile_203',['openFromConfigFile',['../classcam_1_1Camera.html#a345be047450323f7f58a1d7d82bdb51a',1,'cam::Camera']]], + ['opengl_20interoperability_204',['OpenGL interoperability',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html',1,'']]], + ['opengl_20support_205',['OpenGL support',['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html',1,'']]], + ['opengl_2ehpp_206',['opengl.hpp',['https://docs.opencv.org/4.2.0/d4/db0/opengl_8hpp.html',1,'']]], + ['opengl_5fbuffer_207',['OPENGL_BUFFER',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53bac0f3b1297b8b3abf313d7e4e51346d70',1,'cv::_InputArray']]], + ['openglapicallerror_208',['OpenGlApiCallError',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa9f71b79f0b0cb60879173bd9cef8c639',1,'cv::Error']]], + ['opengldrawcallback_209',['OpenGlDrawCallback',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8bed4feb08f866e81514a31fdacaceee',1,'cv::OpenGlDrawCallback'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8bed4feb08f866e81514a31fdacaceee',1,'OpenGlDrawCallback(Global Namespace)']]], + ['openglnotsupported_210',['OpenGlNotSupported',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaaf236f11d402e491ba469756c7062b418',1,'cv::Error']]], + ['opening_5fclosing_5fhats_2emarkdown_211',['opening_closing_hats.markdown',['https://docs.opencv.org/4.2.0/dd/d42/opening__closing__hats_8markdown.html',1,'']]], + ['openmode_212',['openmode',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'basic_ios< char, _Traits >::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'basic_iostream< char >::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'basic_istream< char >::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'basic_istream< char, _Traits >::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'basic_ostream< char >::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'basic_ostream< char, _Traits >::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_fstream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_ifstream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_ios::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_iostream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_istream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_istringstream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_ofstream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_ostream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_ostringstream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::basic_stringstream::openmode'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aa7e2408680d83e0bac8979774aeecdad',1,'std::ios_base::openmode']]], + ['openni_20compatible_20depth_20sensors_213',['Using Kinect and other OpenNI compatible depth sensors',['https://docs.opencv.org/4.2.0/d7/d6f/tutorial_kinect_openni.html',1,'']]], + ['openstream_214',['openStream',['../classnet_1_1mc_1_1tasks_1_1CameraStreamTask.html#a33ad00d78998950b1f1f8a0956141b1f',1,'net::mc::tasks::CameraStreamTask']]], + ['operations_215',['Operations',['https://docs.opencv.org/4.2.0/db/d8e/tutorial_threshold.html',1,'Basic Thresholding Operations'],['https://docs.opencv.org/4.2.0/d7/d16/tutorial_py_table_of_contents_core.html',1,'Core Operations'],['https://docs.opencv.org/4.2.0/d1/d78/tutorial_js_table_of_contents_core.html',1,'Core Operations'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html',1,'Per-element Operations'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html',1,'Set Operations']]], + ['operations_216',['operations',['https://docs.opencv.org/4.2.0/d2/d18/group__core__hal__interface__logical.html',1,'Bitwise logical operations'],['https://eigen.tuxfamily.org/dox/group__TutorialBlockOperations.html',1,'Block operations'],['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'C structures and operations'],['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'Extract horizontal and vertical lines by using morphological operations'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html',1,'Generalized Numeric operations'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html',1,'Graph API: Math operations'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html',1,'Graph API: Pixelwise operations'],['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'The Array class and coefficient-wise operations']]], + ['operations_20and_20functions_217',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], + ['operations_20classes_218',['Boolean Operations Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01508.html',1,'']]], + ['operations_20on_20arrays_219',['Operations on arrays',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html',1,'']]], + ['operations_20on_20images_220',['Operations on Images',['https://docs.opencv.org/4.2.0/d0/d86/tutorial_py_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/d3/df2/tutorial_py_basic_ops.html',1,'Basic Operations on Images'],['https://docs.opencv.org/4.2.0/de/d06/tutorial_js_basic_ops.html',1,'Basic Operations on Images']]], + ['operations_20on_20matrices_221',['Operations on Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'Arithm Operations on Matrices'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'Core Operations on Matrices'],['https://docs.opencv.org/4.2.0/d5/d8e/group__cudaarithm.html',1,'Operations on Matrices']]], + ['operations_20on_20matrices_222',['Graph API: Operations on matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'']]], + ['operations_20on_20matrices_223',['Mask operations on matrices',['https://docs.opencv.org/4.2.0/d7/d37/tutorial_mat_mask_operations.html',1,'']]], + ['operations_20using_20inrange_224',['Thresholding Operations using inRange',['https://docs.opencv.org/4.2.0/da/d97/tutorial_threshold_inRange.html',1,'']]], + ['operations_20with_20images_225',['Operations with images',['https://docs.opencv.org/4.2.0/d5/d98/tutorial_mat_operations.html',1,'']]], + ['operations_2ehpp_226',['operations.hpp',['https://docs.opencv.org/4.2.0/d6/d00/operations_8hpp.html',1,'']]], + ['operator_227',['Laplace Operator',['https://docs.opencv.org/4.2.0/d5/db5/tutorial_laplace_operator.html',1,'']]], + ['operator_20_5fiterator_228',['operator _Iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a32d94193c6ac64834d75515fa2487695',1,'__gnu_debug::_Safe_iterator::operator _Iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a996c63351ba75c6b08c729662f1e2809',1,'__gnu_debug::_Safe_local_iterator::operator _Iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a32d94193c6ac64834d75515fa2487695',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator _Iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a32d94193c6ac64834d75515fa2487695',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator _Iterator()']]], + ['operator_20_5fraiter_229',['operator _RAIter',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#aaa63e1e4c5f2ad032d7deac8dbd8d2d6',1,'__gnu_parallel::_GuardedIterator']]], + ['operator_20_5ftp_20_2a_230',['operator _Tp *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#abf37a20ae4387196fe2a5684ced410dc',1,'cv::AutoBuffer']]], + ['operator_20affine3_3c_20y_20_3e_231',['operator Affine3< Y >',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a5828e816d1b22aef71ddacbdd364f68e',1,'cv::Affine3::operator Affine3< Y >()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a5828e816d1b22aef71ddacbdd364f68e',1,'Affine3< float >::operator Affine3< Y >()']]], + ['operator_20bool_232',['operator bool',['https://docs.opencv.org/4.2.0/d4/dd9/structcvv_1_1impl_1_1CallMetaData.html#ab98ed45df97d6e76f74ae6d89866b01b',1,'cvv::impl::CallMetaData::operator bool()'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a4258c9421f5dd3926779ac7a67051f92',1,'cv::GCompiled::operator bool()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ab7cd2f5971886fc2e4670c40abfa92c8',1,'cv::GStreamingCompiled::operator bool()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#acaf721831dbcc8a403f8c23b2515a9a3',1,'cv::util::optional::operator bool()'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#ab56e37ef0a460ea25aece5842fb4cd49',1,'cv::gapi::fluid::View::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_ios< char, _Traits >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_ios< char, _Traits >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_iostream< char >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_iostream< char >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_istream< char >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_istream< char >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_istream< char, _Traits >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_istream< char, _Traits >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_ostream< char >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_ostream< char >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_ostream< char, _Traits >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'basic_ostream< char, _Traits >::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_fstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_fstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ifstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ifstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ios::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ios::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_iostream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_iostream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_istream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_istream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02491.html#a9fa4ff4cc39750195997c8d7e5e800c6',1,'std::basic_istream::sentry::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_istringstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_istringstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ofstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ofstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ostream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ostream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02639.html#afb51ae0eb2883c81ff22e810e891be9f',1,'std::basic_ostream::sentry::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ostringstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_ostringstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_stringstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ac4bc700ec1a8b5019d1ccdae5c7a4eee',1,'std::basic_stringstream::operator bool() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a2804a8e2d69cd03550a87d46d153c165',1,'std::function< _Res(_ArgTypes...)>::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#a98aca37a82eec323904e712571fa2ab1',1,'std::tr2::bool_set::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a9f21c10165ad856c5b6b2889b815a9bf',1,'std::unique_ptr::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a9e12d69878c17b4cbee312916f5b42e9',1,'std::unique_ptr< _Tp[], _Dp >::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a9f21c10165ad856c5b6b2889b815a9bf',1,'unique_ptr< _Codecvt >::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a9f21c10165ad856c5b6b2889b815a9bf',1,'unique_ptr< _Res_type >::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a9f21c10165ad856c5b6b2889b815a9bf',1,'unique_ptr< _Result< _Res > >::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a9f21c10165ad856c5b6b2889b815a9bf',1,'unique_ptr< _Result_base >::operator bool()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a9f21c10165ad856c5b6b2889b815a9bf',1,'unique_ptr< bool[]>::operator bool()'],['../classrobot_1_1types_1_1DataPoint.html#a7bd06f1a8e8aa9a2b8c40a0f49aeb9b0',1,'robot::types::DataPoint::operator bool()']]], + ['operator_20bool_5ftype_233',['operator bool_type',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a056a9195ab28d22a0278b092901a2ced',1,'cv::cuda::Stream']]], + ['operator_20complex_3c_20t2_20_3e_234',['operator Complex< T2 >',['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#a4a96b4e23292e84682ff67435018c93c',1,'cv::Complex']]], + ['operator_20const_20_5ftp_20_2a_235',['operator const _Tp *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a8e1062498f5ea59f2784883cfd6607cb',1,'cv::AutoBuffer']]], + ['operator_20const_20double_20_2a_236',['operator const double *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a8e1062498f5ea59f2784883cfd6607cb',1,'AutoBuffer< double, 1 >::operator const double *()'],['https://docs.opencv.org/4.2.0/db/d28/structcv_1_1cudev_1_1DynamicSharedMem_3_01double_01_4.html#aa4a93c49320b0a583badf62a86e5ee32',1,'cv::cudev::DynamicSharedMem< double >::operator const double *()']]], + ['operator_20const_20int64_20_2a_237',['operator const int64 *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a8e1062498f5ea59f2784883cfd6607cb',1,'AutoBuffer< int64, 1 >']]], + ['operator_20const_20point_5fiterator_5f_238',['operator const point_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a3fba9aa69c338b7babd7a436ba0cf99f',1,'iterator_']]], + ['operator_20const_20string_20_2a_239',['operator const String *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a8e1062498f5ea59f2784883cfd6607cb',1,'AutoBuffer< String, 1 >']]], + ['operator_20cv_3a_3amat_20_26_240',['Mat &',['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a568312ced61a225000dd78283e8e22b3',1,'cv::detail::tracked_cv_mat']]], + ['operator_20cv_3a_3ascalar_20_26_241',['operator cv::Scalar &',['https://docs.opencv.org/4.2.0/d2/d64/structcv_1_1detail_1_1scalar__wrapper.html#a3f5d1f07562c64a4897698585f5b6d51',1,'cv::detail::scalar_wrapper::Scalar &()'],['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1detail_1_1scalar__wrapper__ocl.html#a07c6f422d5b3ab1664ae05a1d0983877',1,'cv::detail::scalar_wrapper_ocl::Scalar &()']]], + ['operator_20cv_3a_3aumat_20_26_242',['UMat &',['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a4120d3d2dbfc60ab25c942d8673aa985',1,'cv::detail::tracked_cv_umat']]], + ['operator_20double_243',['operator double',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae03480a1f0217c7bf9492f24f3a8d1b7',1,'cv::FileNode::operator double()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a5e3c36ffa74d7786313037c838c429eb',1,'cv::RNG::operator double()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a806b08b56c6b76a036bebc5a02a9145c',1,'cv::RNG_MT19937::operator double()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6193742b4bdb010eb9e5c91f106ca2e7',1,'cv::softdouble::operator double()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6193742b4bdb010eb9e5c91f106ca2e7',1,'operator double()(Global Namespace)']]], + ['operator_20double_20_2a_244',['operator double *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#abf37a20ae4387196fe2a5684ced410dc',1,'AutoBuffer< double, 1 >::operator double *()'],['https://docs.opencv.org/4.2.0/db/d28/structcv_1_1cudev_1_1DynamicSharedMem_3_01double_01_4.html#ab59da6e92a7641af49be147d5d342fe0',1,'cv::cudev::DynamicSharedMem< double >::operator double *()']]], + ['operator_20float_245',['operator float',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ace0c316a0f60a1b8bb66224363f2a5d0',1,'cv::FileNode::operator float()'],['https://docs.opencv.org/4.2.0/df/dc9/classcv_1_1float16__t.html#a528f90d01b978575b57836268e658401',1,'cv::float16_t::operator float()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a6c542e1c042c18b82ac447747445de9b',1,'cv::RNG::operator float()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a8d7f4f55d7cfac265cede2fafed93524',1,'cv::RNG_MT19937::operator float()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga977222074f9cbe76771c7864eeda3985',1,'cv::softfloat::operator float()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga977222074f9cbe76771c7864eeda3985',1,'operator float()(Global Namespace)']]], + ['operator_20gpcsamplesvector_20_26_246',['operator GPCSamplesVector &',['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#a94aaca04120126c35eebd20217a9d7dc',1,'cv::optflow::GPCTrainingSamples']]], + ['operator_20int64_20_2a_247',['operator int64 *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#abf37a20ae4387196fe2a5684ced410dc',1,'AutoBuffer< int64, 1 >']]], + ['operator_20mat_248',['operator Mat',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a14b681f8faccc92f32053ee037f22462',1,'cv::MatExpr']]], + ['operator_20mat_5f_3c_20_5ftp_20_3e_249',['operator Mat_< _Tp >',['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html#a3710f6457f9cad5e09397d9044e6167e',1,'cv::MatCommaInitializer_::operator Mat_< _Tp >()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a437838df79578365571e2253cb14ed18',1,'cv::MatExpr::operator Mat_< _Tp >()']]], + ['operator_20mat_5f_3c_20t2_20_3e_250',['operator Mat_< T2 >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a098ec36001b3998a7511e3c9169f93c8',1,'cv::Mat_::operator Mat_< T2 >()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a098ec36001b3998a7511e3c9169f93c8',1,'Mat_< double >::operator Mat_< T2 >()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a098ec36001b3998a7511e3c9169f93c8',1,'Mat_< float >::operator Mat_< T2 >()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a098ec36001b3998a7511e3c9169f93c8',1,'Mat_< uchar >::operator Mat_< T2 >()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a098ec36001b3998a7511e3c9169f93c8',1,'Mat_< unsigned char >::operator Mat_< T2 >()']]], + ['operator_20matx_3c_20_5ftp_2c_20m_2c_20n_20_3e_251',['operator Matx< _Tp, m, n >',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a75b1b5424cf014f00d8f06ba1818a5d8',1,'cv::Mat']]], + ['operator_20matx_3c_20t2_2c_20m_2c_20n_20_3e_252',['operator Matx< T2, m, n >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'cv::Matx::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< _Tp, cn, 1 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, 1, 3 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, 2, 2 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, 2, 3 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, 3, 3 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, 3, 4 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, 4, 4 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< double, cn, 1 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< float, 2, 3 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< float, 3, 3 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< float, cn, 1 >::operator Matx< T2, m, n >()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a52462c5d76a61e63881055bc96fcc711',1,'Matx< float_type, 4, 4 >::operator Matx< T2, m, n >()']]], + ['operator_20matx_3c_20typename_20datatype_3c_20_5ftp_20_3e_3a_3achannel_5ftype_2c_20m_2c_20n_20_3e_253',['operator Matx< typename DataType< _Tp >::channel_type, m, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7f6403f29aa303ab065267c608280cb0',1,'cv::Mat_']]], + ['operator_20matx_3c_20typename_20datatype_3c_20double_20_3e_3a_3achannel_5ftype_2c_20m_2c_20n_20_3e_254',['operator Matx< typename DataType< double >::channel_type, m, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7f6403f29aa303ab065267c608280cb0',1,'Mat_< double >']]], + ['operator_20matx_3c_20typename_20datatype_3c_20float_20_3e_3a_3achannel_5ftype_2c_20m_2c_20n_20_3e_255',['operator Matx< typename DataType< float >::channel_type, m, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7f6403f29aa303ab065267c608280cb0',1,'Mat_< float >']]], + ['operator_20matx_3c_20typename_20datatype_3c_20uchar_20_3e_3a_3achannel_5ftype_2c_20m_2c_20n_20_3e_256',['operator Matx< typename DataType< uchar >::channel_type, m, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7f6403f29aa303ab065267c608280cb0',1,'Mat_< uchar >']]], + ['operator_20matx_3c_20typename_20datatype_3c_20unsigned_20char_20_3e_3a_3achannel_5ftype_2c_20m_2c_20n_20_3e_257',['operator Matx< typename DataType< unsigned char >::channel_type, m, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7f6403f29aa303ab065267c608280cb0',1,'Mat_< unsigned char >']]], + ['operator_20point3_5f_3c_20_5ftp2_20_3e_258',['operator Point3_< _Tp2 >',['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#ae6befd4f66748e3fde691cbbcbfe263e',1,'cv::Point3_']]], + ['operator_20point_5f_3c_20_5ftp2_20_3e_259',['operator Point_< _Tp2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3a768b66c0a0c744924cc88c14f2322a',1,'cv::Point_::operator Point_< _Tp2 >()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3a768b66c0a0c744924cc88c14f2322a',1,'Point_< double >::operator Point_< _Tp2 >()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3a768b66c0a0c744924cc88c14f2322a',1,'Point_< float >::operator Point_< _Tp2 >()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3a768b66c0a0c744924cc88c14f2322a',1,'Point_< int >::operator Point_< _Tp2 >()']]], + ['operator_20point_5fiterator_5f_260',['operator point_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#aa4c276572f3681c975c496b45962abdd',1,'iterator_']]], + ['operator_20ptrstep_3c_20_5ftp_20_3e_261',['operator PtrStep< _Tp >',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a8b0aa2f9bdf8b40f43be8d8068f2e389',1,'cv::cuda::GpuMat']]], + ['operator_20ptrstepsz_3c_20_5ftp_20_3e_262',['operator PtrStepSz< _Tp >',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a939f8ef4be2fc9a51058c2404d491f74',1,'cv::cuda::GpuMat']]], + ['operator_20rect_5f_3c_20_5ftp2_20_3e_263',['operator Rect_< _Tp2 >',['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#aede48baa3604b77b25b7cf05c070868f',1,'cv::Rect_']]], + ['operator_20result_5ftype_264',['operator result_type',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a84995c206ff9b0a5310ab1423fc9fd34',1,'cv::cudev::NormHamming::operator result_type()'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#a9dd8ad2fdeb5fa975ca5bf124de51851',1,'cv::cudev::NormL1::operator result_type()'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#ad56cf3e17aaa279d1d125d4e0767fbc1',1,'cv::cudev::NormL1< float >::operator result_type()'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#ac931d3d0abf115856d75b94e18db0b18',1,'cv::cudev::NormL2::operator result_type()']]], + ['operator_20scalar_5f_3c_20t2_20_3e_265',['operator Scalar_< T2 >',['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a80e2d82a29fc3de327c8c30343129d7c',1,'cv::Scalar_::operator Scalar_< T2 >()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a80e2d82a29fc3de327c8c30343129d7c',1,'Scalar_< double >::operator Scalar_< T2 >()']]], + ['operator_20schar_266',['operator schar',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a5f01fd132f75a87cc2ed153bf9907240',1,'cv::RNG']]], + ['operator_20short_267',['operator short',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#ac6584b40ce8f99260210bcac615bd1ed',1,'cv::RNG']]], + ['operator_20size_5f_3c_20_5ftp2_20_3e_268',['operator Size_< _Tp2 >',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2479ca9cf7100d03f2f8369c1ac3a6a1',1,'cv::Size_::operator Size_< _Tp2 >()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2479ca9cf7100d03f2f8369c1ac3a6a1',1,'Size_< float >::operator Size_< _Tp2 >()']]], + ['operator_20size_5ft_269',['operator size_t',['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#acccf0bdf7e1bbd3a9d327ef528cb5993',1,'cv::MatStep']]], + ['operator_20softdouble_270',['operator softdouble',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad15be60dda73c34e2d9c79f1d3c2ea34',1,'cv::softfloat::operator softdouble()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad15be60dda73c34e2d9c79f1d3c2ea34',1,'operator softdouble()(Global Namespace)']]], + ['operator_20softfloat_271',['operator softfloat',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga021a93447f30e43636141398859ccd6c',1,'cv::softdouble::operator softfloat()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga021a93447f30e43636141398859ccd6c',1,'operator softfloat()(Global Namespace)']]], + ['operator_20std_3a_3aarray_3c_20_5ftp_2c_20_5fnm_20_3e_272',['operator std::array< _Tp, _Nm >',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a3896b518731a7a1e9cbf59aef1168734',1,'cv::Mat::array< _Tp, _Nm >()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a682ac14db764b33ce1c29cee4b5fe608',1,'cv::Mat_::array< _Tp, _Nm >()']]], + ['operator_20std_3a_3aarray_3c_20double_2c_20_5fnm_20_3e_273',['array< double, _Nm >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a682ac14db764b33ce1c29cee4b5fe608',1,'Mat_< double >']]], + ['operator_20std_3a_3aarray_3c_20float_2c_20_5fnm_20_3e_274',['array< float, _Nm >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a682ac14db764b33ce1c29cee4b5fe608',1,'Mat_< float >']]], + ['operator_20std_3a_3aarray_3c_20uchar_2c_20_5fnm_20_3e_275',['array< uchar, _Nm >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a682ac14db764b33ce1c29cee4b5fe608',1,'Mat_< uchar >']]], + ['operator_20std_3a_3aarray_3c_20unsigned_20char_2c_20_5fnm_20_3e_276',['array< unsigned char, _Nm >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a682ac14db764b33ce1c29cee4b5fe608',1,'Mat_< unsigned char >']]], + ['operator_20std_3a_3astring_277',['operator std::string',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a11de5ea3c4d33e23d584112434852310',1,'cv::FileNode::string()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_ae9015c658f99cf3d48a8563accc79988.html#ae9015c658f99cf3d48a8563accc79988',1,'nlohmann::json_pointer::string()']]], + ['operator_20std_3a_3avector_3c_20_5ftp_20_3e_278',['operator std::vector< _Tp >',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a5d043937e7a4cad632397a9dd8dfee2e',1,'cv::Mat::vector< _Tp >()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a2c3031911a3a2140becb9a4b7dbb1d21',1,'cv::Mat_::vector< _Tp >()']]], + ['operator_20std_3a_3avector_3c_20double_20_3e_279',['vector< double >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a2c3031911a3a2140becb9a4b7dbb1d21',1,'Mat_< double >']]], + ['operator_20std_3a_3avector_3c_20float_20_3e_280',['vector< float >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a2c3031911a3a2140becb9a4b7dbb1d21',1,'Mat_< float >']]], + ['operator_20std_3a_3avector_3c_20uchar_20_3e_281',['vector< uchar >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a2c3031911a3a2140becb9a4b7dbb1d21',1,'Mat_< uchar >']]], + ['operator_20std_3a_3avector_3c_20unsigned_20char_20_3e_282',['vector< unsigned char >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a2c3031911a3a2140becb9a4b7dbb1d21',1,'Mat_< unsigned char >']]], + ['operator_20streamoff_283',['operator streamoff',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a7da1f1b28792e35537bec6d1bc4feb88',1,'std::fpos']]], + ['operator_20string_20_2a_284',['operator String *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#abf37a20ae4387196fe2a5684ced410dc',1,'AutoBuffer< String, 1 >']]], + ['operator_20string_5ftype_285',['operator string_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#aaa88132502a374183f5de838441b9002',1,'std::sub_match::operator string_type()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#aaa88132502a374183f5de838441b9002',1,'sub_match< _Bi_iter >::operator string_type()']]], + ['operator_20uchar_286',['operator uchar',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a8b1a6322d1cac24cd929aecad1041f22',1,'cv::RNG']]], + ['operator_20unsigned_287',['operator unsigned',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a8419e63b25666f77d2d388aaae8122ba',1,'cv::RNG::operator unsigned()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a31e2bc86ef08ccb268a10101ee0ccbbf',1,'cv::RNG_MT19937::operator unsigned()']]], + ['operator_20ushort_288',['operator ushort',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a51e4c416b3ace4840774cceaedcc4b9a',1,'cv::RNG']]], + ['operator_20value_5ft_289',['operator value_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6d4b8df10ecc533a50823e8805f4a873.html#a6d4b8df10ecc533a50823e8805f4a873',1,'nlohmann::basic_json']]], + ['operator_20valuetype_290',['operator ValueType',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ada1463d8d7ba77865f28f5e83dec7f33.html#ada1463d8d7ba77865f28f5e83dec7f33',1,'nlohmann::basic_json']]], + ['operator_20vec3b_291',['operator Vec3b',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#af5807af9aefd3b74c7feab6544828bec',1,'cv::viz::Color']]], + ['operator_20vec_3c_20_5ftp_2c_202_20_3e_292',['operator Vec< _Tp, 2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a625700af6b447b0803907dc6d845a6b4',1,'cv::Point_']]], + ['operator_20vec_3c_20_5ftp_2c_203_20_3e_293',['operator Vec< _Tp, 3 >',['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a13bc76b8cadfd7a7bc903fd8a8be6167',1,'cv::Point3_']]], + ['operator_20vec_3c_20_5ftp_2c_20n_20_3e_294',['operator Vec< _Tp, n >',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ae4766cf75071f4e4db698c4120abe57b',1,'cv::Mat']]], + ['operator_20vec_3c_20double_2c_202_20_3e_295',['operator Vec< double, 2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a625700af6b447b0803907dc6d845a6b4',1,'Point_< double >']]], + ['operator_20vec_3c_20float_2c_202_20_3e_296',['operator Vec< float, 2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a625700af6b447b0803907dc6d845a6b4',1,'Point_< float >']]], + ['operator_20vec_3c_20t2_2c_20cn_20_3e_297',['operator Vec< T2, cn >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'cv::Vec::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< _Tp, 4 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, 2 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, 3 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, 4 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, nFeatures >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< float, 2 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< float, 3 >::operator Vec< T2, cn >()']]], + ['operator_20vec_3c_20typename_20datatype_3c_20_5ftp_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_298',['operator Vec< typename DataType< _Tp >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'cv::Mat_']]], + ['operator_20vec_3c_20typename_20datatype_3c_20double_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_299',['operator Vec< typename DataType< double >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< double >']]], + ['operator_20vec_3c_20typename_20datatype_3c_20float_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_300',['operator Vec< typename DataType< float >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< float >']]], + ['operator_20vec_3c_20typename_20datatype_3c_20uchar_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_301',['operator Vec< typename DataType< uchar >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< uchar >']]], + ['operator_20vec_3c_20typename_20datatype_3c_20unsigned_20char_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_302',['operator Vec< typename DataType< unsigned char >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< unsigned char >']]], + ['operator_21_303',['operator!',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ios< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ios< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_iostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_iostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_fstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_fstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ifstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ifstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ios::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ios::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_iostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_iostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ofstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ofstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_stringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_stringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8ae9cabed8e455713324dacd39bedef1',1,'std::valarray::operator!()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8ae9cabed8e455713324dacd39bedef1',1,'valarray< size_t >::operator!()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedd36c90ccd8d1c8ea0d9d121764687e',1,'cv::cudev::operator!(const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a99111955fe2272dece21813539289',1,'cv::cudev::operator!(const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691ce9b6cae1134cdbf39a5ac37ffbc6',1,'cv::cudev::operator!(const Expr< Body > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad387b8de401308ad8764356a902294d4',1,'cv::cudev::operator!(const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga096854f6b69712bd3a6b08b240b390d8',1,'cv::cudev::operator!(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4d6a028a6b6192bf17c25ca75d7f84',1,'cv::cudev::operator!(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2bc16d5e23552ba6fd31b1912fa4a6f',1,'cv::cudev::operator!(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2f274425168b4133ef5270b0ddae7ae',1,'cv::cudev::operator!(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd37e74306bce3962b9b081db9c6064a',1,'cv::cudev::operator!(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38aa67c0f1b4dc9ebe976cdbb2c45771',1,'cv::cudev::operator!(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a32684d4325c9ac27aa698b23ee0ab',1,'cv::cudev::operator!(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6a772b81ca9afc60e6d06f37443b48f',1,'cv::cudev::operator!(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15b5f3146f6815ccfaa75b313cf1bece',1,'cv::cudev::operator!(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa86526fb4e3341ae51d619b0db2cd379',1,'cv::cudev::operator!(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadca17a33d6f1d4b7c85834a156859940',1,'cv::cudev::operator!(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5072fb2fd15a0e93d7cda0cd295bc894',1,'cv::cudev::operator!(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1938b6ba569496387172de1db0a90a9',1,'cv::cudev::operator!(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga710384a11224d911dc1c06966407b070',1,'cv::cudev::operator!(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4575777615eafb52b138f3f70332fcad',1,'cv::cudev::operator!(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66daea7b4632dffed59485b06e850135',1,'cv::cudev::operator!(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41d458a2f3eb470ef98348bc8dcaeec7',1,'cv::cudev::operator!(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga285b3d30ef7b1b1dcf391e62f0a7ab84',1,'cv::cudev::operator!(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ad51bb71a9827aba1389f15aecaf666',1,'cv::cudev::operator!(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48732936efbae4811ff6bd0a5fa6e018',1,'cv::cudev::operator!(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef97c1bdfbf913fbcb909c9014bf2bd0',1,'cv::cudev::operator!(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a5369d6b2d681d7d61226ab28986a19',1,'cv::cudev::operator!(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55a6f14fd6c882ece5bbbeb8633c9191',1,'cv::cudev::operator!(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfd535749b1c35f92e47e69cab7d08af',1,'cv::cudev::operator!(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b788e3270d0fc245b0566f01415334f',1,'cv::cudev::operator!(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9faa344cc89c3f9896d763e4fa9bb9a4',1,'cv::cudev::operator!(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafef7c2b87b9ce254712c0628519895a5',1,'cv::cudev::operator!(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5414c9eaf8734e95201f4485b744d3b2',1,'cv::cudev::operator!(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0314d3c8d73359a7ce7e39c43ed67568',1,'cv::cudev::operator!(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4d8cc9fe8152f04f27ef3f65eb37db1',1,'cv::cudev::operator!(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d66ce3b8d478e84d239d1f28fcf1cf',1,'cv::cudev::operator!(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca58de1b50f1b0f27f31afa3c1a0082e',1,'cv::cudev::operator!(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedd36c90ccd8d1c8ea0d9d121764687e',1,'operator!(const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a99111955fe2272dece21813539289',1,'operator!(const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691ce9b6cae1134cdbf39a5ac37ffbc6',1,'operator!(const Expr< Body > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad387b8de401308ad8764356a902294d4',1,'operator!(const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga096854f6b69712bd3a6b08b240b390d8',1,'operator!(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4d6a028a6b6192bf17c25ca75d7f84',1,'operator!(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2bc16d5e23552ba6fd31b1912fa4a6f',1,'operator!(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2f274425168b4133ef5270b0ddae7ae',1,'operator!(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd37e74306bce3962b9b081db9c6064a',1,'operator!(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38aa67c0f1b4dc9ebe976cdbb2c45771',1,'operator!(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a32684d4325c9ac27aa698b23ee0ab',1,'operator!(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6a772b81ca9afc60e6d06f37443b48f',1,'operator!(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15b5f3146f6815ccfaa75b313cf1bece',1,'operator!(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa86526fb4e3341ae51d619b0db2cd379',1,'operator!(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadca17a33d6f1d4b7c85834a156859940',1,'operator!(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5072fb2fd15a0e93d7cda0cd295bc894',1,'operator!(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1938b6ba569496387172de1db0a90a9',1,'operator!(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga710384a11224d911dc1c06966407b070',1,'operator!(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4575777615eafb52b138f3f70332fcad',1,'operator!(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66daea7b4632dffed59485b06e850135',1,'operator!(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41d458a2f3eb470ef98348bc8dcaeec7',1,'operator!(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga285b3d30ef7b1b1dcf391e62f0a7ab84',1,'operator!(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ad51bb71a9827aba1389f15aecaf666',1,'operator!(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48732936efbae4811ff6bd0a5fa6e018',1,'operator!(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef97c1bdfbf913fbcb909c9014bf2bd0',1,'operator!(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a5369d6b2d681d7d61226ab28986a19',1,'operator!(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55a6f14fd6c882ece5bbbeb8633c9191',1,'operator!(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfd535749b1c35f92e47e69cab7d08af',1,'operator!(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b788e3270d0fc245b0566f01415334f',1,'operator!(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9faa344cc89c3f9896d763e4fa9bb9a4',1,'operator!(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafef7c2b87b9ce254712c0628519895a5',1,'operator!(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5414c9eaf8734e95201f4485b744d3b2',1,'operator!(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0314d3c8d73359a7ce7e39c43ed67568',1,'operator!(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4d8cc9fe8152f04f27ef3f65eb37db1',1,'operator!(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d66ce3b8d478e84d239d1f28fcf1cf',1,'operator!(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca58de1b50f1b0f27f31afa3c1a0082e',1,'operator!(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8ae9cabed8e455713324dacd39bedef1',1,'operator!() const(Global Namespace)']]], + ['operator_21_3d_304',['operator!=',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a224780d14e4f8aae3e6127d605736bd1',1,'cv::FileNodeIterator::operator!=(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a224780d14e4f8aae3e6127d605736bd1',1,'cv::FileNodeIterator::operator!=(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a6b16d9a0f3bb63fa355a63a05a5fd397',1,'cv::GMatDesc::operator!=()'],['https://docs.opencv.org/4.2.0/d1/d6a/structcv_1_1GScalarDesc.html#a7aa7e15af456abb71d568281f4148781',1,'cv::GScalarDesc::operator!=()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a89ee700214e5c588fc9c2f16dc5f0814',1,'cv::MatExpr::operator!=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0c7b11e74936908ee2fb47e4eb9c5e18',1,'cv::MatExpr::operator!=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a25f71801b3fb6ab5395c2dbcc9cc60ad',1,'cv::MatExpr::operator!=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a76d099d1e862f773c3f0d234b2261feb',1,'cv::MatExpr::operator!=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7105f56350ad1d16b716a3664edbd7f5',1,'cv::MatExpr::operator!=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a89ee700214e5c588fc9c2f16dc5f0814',1,'cv::MatExpr::operator!=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0c7b11e74936908ee2fb47e4eb9c5e18',1,'cv::MatExpr::operator!=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a25f71801b3fb6ab5395c2dbcc9cc60ad',1,'cv::MatExpr::operator!=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a76d099d1e862f773c3f0d234b2261feb',1,'cv::MatExpr::operator!=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7105f56350ad1d16b716a3664edbd7f5',1,'cv::MatExpr::operator!=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#af0917c4e9713001260d67db171256a93',1,'cv::MatSize::operator!=()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'cv::Matx::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'cv::Matx::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< _Tp, cn, 1 >::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< _Tp, cn, 1 >::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 1, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 1, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 2 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 2 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 4, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 4, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, cn, 1 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, cn, 1 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 2, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 2, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 3, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 3, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, cn, 1 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, cn, 1 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float_type, 4, 4 >::operator!=(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float_type, 4, 4 >::operator!=(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3e6d2ce9ae1fc533c68737efecdd1b5b',1,'cv::softdouble::operator!=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafa7691dc904caca8588ea6a4b0954e08',1,'cv::softfloat::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#af00d0999bd1cb1c6a731bf5327caea72',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#af00d0999bd1cb1c6a731bf5327caea72',1,'__gnu_pbds::detail::bin_search_tree_node_it_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#ade2fe116ea5d8252d04e3205d8a097f5',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator!=(const binary_heap_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#ac2a94a28e8beb3b3b2e66632636930f9',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator!=(const binary_heap_point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#ac2a94a28e8beb3b3b2e66632636930f9',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#aa943274d090a3ccb2e74e2937ac00e13',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator!=(const left_child_next_sibling_heap_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#ad5876d650788d02f01035cdb3040dd88',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator!=(const left_child_next_sibling_heap_node_point_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#ad5876d650788d02f01035cdb3040dd88',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a210f5b96aa65b4a025d3f4998378862f',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a210f5b96aa65b4a025d3f4998378862f',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a40cf56640357123e880f39e36454b552',1,'const_iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5b0ebe0ad2f13fb20de8c5cff2855216',1,'const_iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a40cf56640357123e880f39e36454b552',1,'iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5b0ebe0ad2f13fb20de8c5cff2855216',1,'iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a40cf56640357123e880f39e36454b552',1,'point_const_iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5b0ebe0ad2f13fb20de8c5cff2855216',1,'point_const_iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#ae8c663552f5380496391513e71799847',1,'point_iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a0b828d52a1d27c8e786c7171a65bff97',1,'point_iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05507.html#a0ace445834d8a331ce293f4e3214b591',1,'std::_Fwd_list_const_iterator::operator!='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05503.html#a0ace445834d8a331ce293f4e3214b591',1,'std::_Fwd_list_iterator::operator!='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa69e1223ce6dc3f69fd44cc331bb170e',1,'std::bitset::operator!=(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa69e1223ce6dc3f69fd44cc331bb170e',1,'std::bitset::operator!=(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#adbf547d835746748a205bb57fd81a43f',1,'std::locale::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a2ec683d37e64edce2bea9366a5415677',1,'std::regex_iterator::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a6446149296f14aee3eef4ac516a96f52',1,'std::regex_token_iterator::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a028c7ac8094d610042fd0f9feca68f63',1,'Eigen::MatrixBase::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a028c7ac8094d610042fd0f9feca68f63',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a028c7ac8094d610042fd0f9feca68f63',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'Eigen::QuaternionBase::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator!=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6e2e21da48f5d9471716cd868a068327.html#a6e2e21da48f5d9471716cd868a068327',1,'nlohmann::basic_json::operator!='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4d581dc2ab78091885f9af24d13749dc.html#a4d581dc2ab78091885f9af24d13749dc',1,'nlohmann::basic_json::operator!='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa9861979059799375c0fff68174610ba.html#aa9861979059799375c0fff68174610ba',1,'nlohmann::basic_json::operator!='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a760bf39cc5477bc663d8bb3c44aabf6a.html#a760bf39cc5477bc663d8bb3c44aabf6a',1,'nlohmann::byte_container_with_subtype::operator!=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a6779edcf28e6f018a3bbb29c0b4b5e1e.html#a6779edcf28e6f018a3bbb29c0b4b5e1e',1,'nlohmann::json_pointer::operator!='],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacfed05378c432f84c46e3a2e80e321e8',1,'cv::operator!=()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8292fe7dc983ee976f9f112bcb9b6c1d',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7d957663c54fb266f22662e02d515a0',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga134eff23af476bb078268d470c5a1eab',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30827c997d70e1ec669dfe661188bf97',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a85ae32eae025d733fb5e3ef556bf1a',1,'cv::cudev::operator!=(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b6fc14c39892e90df1b408a88f4a89',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae195999272c703fd97df7a3b66e061c1',1,'cv::cudev::operator!=(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a70181a870d6be3b2045a194b2ba0a3',1,'cv::cudev::operator!=(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0433dbcd94c2e678a7c1938c24ee08da',1,'cv::cudev::operator!=(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26dbfbf9dc0e5fc90b82f41229c84899',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1efe076c9144b56c61e17b96fa6e210e',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e37d9a1418a94d91adf91c477519144',1,'cv::cudev::operator!=(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa35d062549d2cfa7d9841e1ac7799a44',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f22949e60450f64d1b3c459de0e7a27',1,'cv::cudev::operator!=(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71df1ef74ebec36966335c1b5449a07b',1,'cv::cudev::operator!=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51b3e383f16f20dc1928d89f4524bce',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a34b56e3225c861848f01b4e3b1c44a',1,'cv::cudev::operator!=(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61134a26d4c0e5ca4467638109358eaa',1,'cv::cudev::operator!=(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac01068a2f43c82f8e14d0ac68996c903',1,'cv::cudev::operator!=(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00b76efa5a61126d47883ddbf36799f0',1,'cv::cudev::operator!=(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1a88913cdea995341a95e23135b06bf',1,'cv::cudev::operator!=(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa295a03a44435b12c5b2ce66bf4c1d8d',1,'cv::cudev::operator!=(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba8ae9e88782d3b46baa0cd308b594ca',1,'cv::cudev::operator!=(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc15d3d94c1bf3032fa82162cd5d08c2',1,'cv::cudev::operator!=(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bbfb03a53e5581effe1f9f98d30873',1,'cv::cudev::operator!=(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35e7a1277bb5d5249c578b0a289f4a5b',1,'cv::cudev::operator!=(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2cfd0dba2d83f0dd7e267fb537c6df3',1,'cv::cudev::operator!=(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga904fe1a365ccf3f52ded833f98ab4c1d',1,'cv::cudev::operator!=(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27dfb14836d9f082e79d9a804291564',1,'cv::cudev::operator!=(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c715a1f404a93f452cd718cd61822ef',1,'cv::cudev::operator!=(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1196cca16594f3ca574ffae1e94e7b1',1,'cv::cudev::operator!=(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2540630d91b7767930621ce3c6fd76e1',1,'cv::cudev::operator!=(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb08af5c7f389e522b5822a4ed2f9461',1,'cv::cudev::operator!=(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23c79a1928e13afc502bb8b7f331e430',1,'cv::cudev::operator!=(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc40e9339bd3ac67fd8cbd5b027e18d',1,'cv::cudev::operator!=(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f3ae663608af22f0c147d4d1c0cec9b',1,'cv::cudev::operator!=(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4dfd8489e7ec481cbe03b56039599e',1,'cv::cudev::operator!=(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae80f5e0d14e29c9a5505deee930a41d7',1,'cv::cudev::operator!=(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad791250abb63d31f2fd906d838f3994a',1,'cv::cudev::operator!=(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ce12579d99d81239384b64b528d9e67',1,'cv::cudev::operator!=(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ddfdc36315c9e7eae56b412d83b0a05',1,'cv::cudev::operator!=(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga781786668348ca67ef6fc9f333fd76bd',1,'cv::cudev::operator!=(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32d5f8d24bdce45881f83215c243ed9d',1,'cv::cudev::operator!=(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ba755d444526c74046317135fdc2f06',1,'cv::cudev::operator!=(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga018afdf83525378f4fb0e87057ddd12c',1,'cv::cudev::operator!=(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fbf5e5e077bbe431d43e5dfc3199595',1,'cv::cudev::operator!=(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a74d8b5cff07e001fa59b0bdf4bdc8',1,'cv::cudev::operator!=(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7e2f8cdd7843ea8e78f8c1e4c69df0b',1,'cv::cudev::operator!=(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d3a7254a567bbb65a400e55dd85ff93',1,'cv::cudev::operator!=(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0e2aaffe5179188a45b52ed7d05b665',1,'cv::cudev::operator!=(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa416b9a794190e20a62b08cde74fa95c',1,'cv::cudev::operator!=(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06e89f04ab74961a37ba14c5e2f84832',1,'cv::cudev::operator!=(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga059791beca5a629072a39a00978f4a7f',1,'cv::cudev::operator!=(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d61cb0c52994efdf53d7c912582bf8b',1,'cv::cudev::operator!=(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7bcfb20794a46293a7d4e7301b44f7',1,'cv::cudev::operator!=(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02ef404a904a3ec832c9add12935eacc',1,'cv::cudev::operator!=(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14e0dc7340bf0380c8e7ff3b6ad61d8d',1,'cv::cudev::operator!=(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35c3b84bb03b81839a2c3e9c1055a80f',1,'cv::cudev::operator!=(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7f1eaafa2eba2a41778d32070a3a2a',1,'cv::cudev::operator!=(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba5e0f75bf2cc2fd562e3df677ea694',1,'cv::cudev::operator!=(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae703f571d189f59c10ac1b776fb51404',1,'cv::cudev::operator!=(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a865177e087ade5119108ad893fc40',1,'cv::cudev::operator!=(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f332aaeee915649e3ba300bfd6e0862',1,'cv::cudev::operator!=(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f549d8efea1133b101ffce070bf7bb1',1,'cv::cudev::operator!=(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3dc461d11161c9c0269d007f9c0664',1,'cv::cudev::operator!=(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301514bbd97b257d879b7b956231618d',1,'cv::cudev::operator!=(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f6246f3563a2788bdab0ffd43946a28',1,'cv::cudev::operator!=(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27c5affcafc4dfbaa5bd97878a85805',1,'cv::cudev::operator!=(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0cda31d15dbbaad26ee24e31deaeb0',1,'cv::cudev::operator!=(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab81a1eee4dcf637837acd349d99bc9',1,'cv::cudev::operator!=(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeac8a5773046490bb3e174f794f9a3bf',1,'cv::cudev::operator!=(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbb8eef6cbff069ea514a1d08d1c1acc',1,'cv::cudev::operator!=(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c79714df94e4874571a6f6fbe802261',1,'cv::cudev::operator!=(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92977e9cd4b8299c7b4193be69e38140',1,'cv::cudev::operator!=(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade3a83bdc7ef86bfdbf599502d46baca',1,'cv::cudev::operator!=(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga770fa7102571a71eecff41db456a32a0',1,'cv::cudev::operator!=(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16f17453bfe07cca9818f9e8b3934955',1,'cv::cudev::operator!=(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37bc7a2403de26ee46a764916836e73',1,'cv::cudev::operator!=(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafaf36c9bcfe7c72a427dfaac657e291d',1,'cv::cudev::operator!=(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadad41dbc0aece9daa78fcf41a69673de',1,'cv::cudev::operator!=(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cb807429ac3b09197050a95728f556a',1,'cv::cudev::operator!=(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba1495d7b1d080f397329f02159c01e',1,'cv::cudev::operator!=(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9baa29316abd1f38a665c6cbc8cacab7',1,'cv::cudev::operator!=(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7603a241df59c649cc55105a1628df',1,'cv::cudev::operator!=(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195211f7ce1c4f3d67db531c2831f724',1,'cv::cudev::operator!=(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41419f07a921918f0701c998a8d76fb',1,'cv::cudev::operator!=(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae089ee9fd05ad99eebf886d55bfe7152',1,'cv::cudev::operator!=(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5dbacd27f428cce7bc009baf93a731f8',1,'cv::cudev::operator!=(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ca3d062d928c0f22cac521b71d9531a',1,'cv::cudev::operator!=(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e9806f1e89dded32d75e063645de53',1,'cv::cudev::operator!=(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e5d5b6b33702c5f4049358633041d36',1,'cv::cudev::operator!=(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga831de1ee68dbe4cabe2785d3b4ee4823',1,'cv::cudev::operator!=(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae125433024aa211123e58c04f034c750',1,'cv::cudev::operator!=(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c10e74e42a3199d23aacd569ecbdf3f',1,'cv::cudev::operator!=(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99fea0f04ddb67c943effb33762e48d',1,'cv::cudev::operator!=(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f4f66d6868e12eaccee9521e2751810',1,'cv::cudev::operator!=(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga358969872ca6b79e0c141bd4682085df',1,'cv::cudev::operator!=(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga300d7581d3c1bc8213d2690878045735',1,'cv::cudev::operator!=(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25c43cc94bc4759b75116adfe773f496',1,'cv::cudev::operator!=(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51077c5df4c6a888b84142e1af07b23',1,'cv::cudev::operator!=(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb9347618d1909b4307d5f5e8d5e0ec1',1,'cv::cudev::operator!=(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70e9295c70897f7ee8f165b2b9b92006',1,'cv::cudev::operator!=(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7816e638f08658a7127889f8924d463a',1,'cv::cudev::operator!=(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec66007c1a31dcf3aa21addda8d2e057',1,'cv::cudev::operator!=(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5df23018756bf58482b48b72f91c69',1,'cv::cudev::operator!=(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9f59dd31ae3f09e713717a052fb2d41',1,'cv::cudev::operator!=(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2edb4f9db0181f0ed159c100272de19e',1,'cv::cudev::operator!=(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14cc69402191ad1a9fadafc1797e4e5',1,'cv::cudev::operator!=(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefc9c61d220f8a87a7c07e07a1de92ef',1,'cv::cudev::operator!=(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c1259a165b16ae5e1a2e7582dc6ca19',1,'cv::cudev::operator!=(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27400033a8ccdaf73828d9569ab1d11f',1,'cv::cudev::operator!=(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64ebcee14a400f7d929e78336d556f76',1,'cv::cudev::operator!=(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c2fc1b7beb65f98f4f60313e89892',1,'cv::cudev::operator!=(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd4ea537ef260913359d331676ee41',1,'cv::cudev::operator!=(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d16922ec836552a427512b69378cea5',1,'cv::cudev::operator!=(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23335c5da9c49fc7fad795f8151ed17e',1,'cv::cudev::operator!=(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e6ecff1ed67f5619c81d15d6c61d2aa',1,'cv::cudev::operator!=(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d04608dbf78c558bbc9fe3157c1fa03',1,'cv::cudev::operator!=(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2b7ac6b676b027054f92659fcbd62b3',1,'cv::cudev::operator!=(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1074c3499e6d2197ec635fb11e013f59',1,'cv::cudev::operator!=(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#ad56f6fcb23f2a9cfb755740235424a11',1,'cv::gapi::operator!=()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a1fd873abaeb604fdbf9e008118552f6e',1,'cv::gapi::own::operator!=(const Rect &lhs, const Rect &rhs)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a9afb185df936f93b5388f549a463e618',1,'cv::gapi::own::operator!=(const Size &lhs, const Size &rhs)'],['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#a026ad4480a333be3a691a7c7311da00b',1,'cv::tbm::operator!=()'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#aefce3a0692acbbc03674218a59ded1bc',1,'cv::util::operator!=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafa7691dc904caca8588ea6a4b0954e08',1,'operator!=(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3e6d2ce9ae1fc533c68737efecdd1b5b',1,'operator!=(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacfed05378c432f84c46e3a2e80e321e8',1,'operator!=(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8292fe7dc983ee976f9f112bcb9b6c1d',1,'operator!=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7d957663c54fb266f22662e02d515a0',1,'operator!=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga134eff23af476bb078268d470c5a1eab',1,'operator!=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30827c997d70e1ec669dfe661188bf97',1,'operator!=(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a85ae32eae025d733fb5e3ef556bf1a',1,'operator!=(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b6fc14c39892e90df1b408a88f4a89',1,'operator!=(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae195999272c703fd97df7a3b66e061c1',1,'operator!=(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a70181a870d6be3b2045a194b2ba0a3',1,'operator!=(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0433dbcd94c2e678a7c1938c24ee08da',1,'operator!=(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26dbfbf9dc0e5fc90b82f41229c84899',1,'operator!=(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1efe076c9144b56c61e17b96fa6e210e',1,'operator!=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e37d9a1418a94d91adf91c477519144',1,'operator!=(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa35d062549d2cfa7d9841e1ac7799a44',1,'operator!=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f22949e60450f64d1b3c459de0e7a27',1,'operator!=(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71df1ef74ebec36966335c1b5449a07b',1,'operator!=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51b3e383f16f20dc1928d89f4524bce',1,'operator!=(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a34b56e3225c861848f01b4e3b1c44a',1,'operator!=(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61134a26d4c0e5ca4467638109358eaa',1,'operator!=(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac01068a2f43c82f8e14d0ac68996c903',1,'operator!=(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00b76efa5a61126d47883ddbf36799f0',1,'operator!=(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1a88913cdea995341a95e23135b06bf',1,'operator!=(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa295a03a44435b12c5b2ce66bf4c1d8d',1,'operator!=(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba8ae9e88782d3b46baa0cd308b594ca',1,'operator!=(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc15d3d94c1bf3032fa82162cd5d08c2',1,'operator!=(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bbfb03a53e5581effe1f9f98d30873',1,'operator!=(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35e7a1277bb5d5249c578b0a289f4a5b',1,'operator!=(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2cfd0dba2d83f0dd7e267fb537c6df3',1,'operator!=(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga904fe1a365ccf3f52ded833f98ab4c1d',1,'operator!=(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27dfb14836d9f082e79d9a804291564',1,'operator!=(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c715a1f404a93f452cd718cd61822ef',1,'operator!=(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1196cca16594f3ca574ffae1e94e7b1',1,'operator!=(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2540630d91b7767930621ce3c6fd76e1',1,'operator!=(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb08af5c7f389e522b5822a4ed2f9461',1,'operator!=(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23c79a1928e13afc502bb8b7f331e430',1,'operator!=(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc40e9339bd3ac67fd8cbd5b027e18d',1,'operator!=(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f3ae663608af22f0c147d4d1c0cec9b',1,'operator!=(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4dfd8489e7ec481cbe03b56039599e',1,'operator!=(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae80f5e0d14e29c9a5505deee930a41d7',1,'operator!=(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad791250abb63d31f2fd906d838f3994a',1,'operator!=(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ce12579d99d81239384b64b528d9e67',1,'operator!=(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ddfdc36315c9e7eae56b412d83b0a05',1,'operator!=(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga781786668348ca67ef6fc9f333fd76bd',1,'operator!=(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32d5f8d24bdce45881f83215c243ed9d',1,'operator!=(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ba755d444526c74046317135fdc2f06',1,'operator!=(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga018afdf83525378f4fb0e87057ddd12c',1,'operator!=(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fbf5e5e077bbe431d43e5dfc3199595',1,'operator!=(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a74d8b5cff07e001fa59b0bdf4bdc8',1,'operator!=(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7e2f8cdd7843ea8e78f8c1e4c69df0b',1,'operator!=(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d3a7254a567bbb65a400e55dd85ff93',1,'operator!=(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0e2aaffe5179188a45b52ed7d05b665',1,'operator!=(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa416b9a794190e20a62b08cde74fa95c',1,'operator!=(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06e89f04ab74961a37ba14c5e2f84832',1,'operator!=(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga059791beca5a629072a39a00978f4a7f',1,'operator!=(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d61cb0c52994efdf53d7c912582bf8b',1,'operator!=(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7bcfb20794a46293a7d4e7301b44f7',1,'operator!=(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02ef404a904a3ec832c9add12935eacc',1,'operator!=(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14e0dc7340bf0380c8e7ff3b6ad61d8d',1,'operator!=(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35c3b84bb03b81839a2c3e9c1055a80f',1,'operator!=(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7f1eaafa2eba2a41778d32070a3a2a',1,'operator!=(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba5e0f75bf2cc2fd562e3df677ea694',1,'operator!=(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae703f571d189f59c10ac1b776fb51404',1,'operator!=(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a865177e087ade5119108ad893fc40',1,'operator!=(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f332aaeee915649e3ba300bfd6e0862',1,'operator!=(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f549d8efea1133b101ffce070bf7bb1',1,'operator!=(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3dc461d11161c9c0269d007f9c0664',1,'operator!=(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301514bbd97b257d879b7b956231618d',1,'operator!=(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f6246f3563a2788bdab0ffd43946a28',1,'operator!=(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27c5affcafc4dfbaa5bd97878a85805',1,'operator!=(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0cda31d15dbbaad26ee24e31deaeb0',1,'operator!=(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab81a1eee4dcf637837acd349d99bc9',1,'operator!=(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeac8a5773046490bb3e174f794f9a3bf',1,'operator!=(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbb8eef6cbff069ea514a1d08d1c1acc',1,'operator!=(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c79714df94e4874571a6f6fbe802261',1,'operator!=(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92977e9cd4b8299c7b4193be69e38140',1,'operator!=(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade3a83bdc7ef86bfdbf599502d46baca',1,'operator!=(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga770fa7102571a71eecff41db456a32a0',1,'operator!=(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16f17453bfe07cca9818f9e8b3934955',1,'operator!=(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37bc7a2403de26ee46a764916836e73',1,'operator!=(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafaf36c9bcfe7c72a427dfaac657e291d',1,'operator!=(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadad41dbc0aece9daa78fcf41a69673de',1,'operator!=(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cb807429ac3b09197050a95728f556a',1,'operator!=(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba1495d7b1d080f397329f02159c01e',1,'operator!=(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9baa29316abd1f38a665c6cbc8cacab7',1,'operator!=(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7603a241df59c649cc55105a1628df',1,'operator!=(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195211f7ce1c4f3d67db531c2831f724',1,'operator!=(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41419f07a921918f0701c998a8d76fb',1,'operator!=(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae089ee9fd05ad99eebf886d55bfe7152',1,'operator!=(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5dbacd27f428cce7bc009baf93a731f8',1,'operator!=(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ca3d062d928c0f22cac521b71d9531a',1,'operator!=(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e9806f1e89dded32d75e063645de53',1,'operator!=(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e5d5b6b33702c5f4049358633041d36',1,'operator!=(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga831de1ee68dbe4cabe2785d3b4ee4823',1,'operator!=(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae125433024aa211123e58c04f034c750',1,'operator!=(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c10e74e42a3199d23aacd569ecbdf3f',1,'operator!=(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99fea0f04ddb67c943effb33762e48d',1,'operator!=(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f4f66d6868e12eaccee9521e2751810',1,'operator!=(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga358969872ca6b79e0c141bd4682085df',1,'operator!=(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga300d7581d3c1bc8213d2690878045735',1,'operator!=(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25c43cc94bc4759b75116adfe773f496',1,'operator!=(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51077c5df4c6a888b84142e1af07b23',1,'operator!=(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb9347618d1909b4307d5f5e8d5e0ec1',1,'operator!=(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70e9295c70897f7ee8f165b2b9b92006',1,'operator!=(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7816e638f08658a7127889f8924d463a',1,'operator!=(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec66007c1a31dcf3aa21addda8d2e057',1,'operator!=(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5df23018756bf58482b48b72f91c69',1,'operator!=(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9f59dd31ae3f09e713717a052fb2d41',1,'operator!=(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2edb4f9db0181f0ed159c100272de19e',1,'operator!=(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14cc69402191ad1a9fadafc1797e4e5',1,'operator!=(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefc9c61d220f8a87a7c07e07a1de92ef',1,'operator!=(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c1259a165b16ae5e1a2e7582dc6ca19',1,'operator!=(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27400033a8ccdaf73828d9569ab1d11f',1,'operator!=(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64ebcee14a400f7d929e78336d556f76',1,'operator!=(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c2fc1b7beb65f98f4f60313e89892',1,'operator!=(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd4ea537ef260913359d331676ee41',1,'operator!=(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d16922ec836552a427512b69378cea5',1,'operator!=(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23335c5da9c49fc7fad795f8151ed17e',1,'operator!=(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e6ecff1ed67f5619c81d15d6c61d2aa',1,'operator!=(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d04608dbf78c558bbc9fe3157c1fa03',1,'operator!=(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2b7ac6b676b027054f92659fcbd62b3',1,'operator!=(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1074c3499e6d2197ec635fb11e013f59',1,'operator!=(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ab051cea08cf039852e3351b93b8c5a81',1,'__gnu_cxx::operator!=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a1181402b4656a1da4bf2e9608aed3c38',1,'__gnu_cxx::operator!=(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a9deee1071e354ea98296b431b4643511',1,'__gnu_cxx::operator!=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga51a6d053b3eb004ee172b8e7ef066854',1,'std::operator!=(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a481ee02f06a7c42bd2762516975d7082',1,'std::operator!=(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a98c391c7d64a5a01cf0d162c4fb959ca',1,'std::operator!=(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#gafb9c9578afd0299fc357581cb848f2fd',1,'std::operator!=(const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__lhs, const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga226dae1d9406b9c3804f20d31c15e21a',1,'std::operator!=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga08598cac266ed03507603ca6d6c27ce2',1,'std::operator!=(const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__lhs, const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a48d985ba8cc72e159372b14b9114da73',1,'std::operator!=(const function< _Res(_Args...)> &__f, nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac0daaa77f5550fd185352175aa05fc89',1,'std::operator!=(nullptr_t, const function< _Res(_Args...)> &__f) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga58cddddd716e5fe8d9ef54732399b68f',1,'std::operator!=(const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__lhs, const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a20729b0ed4cf42aa7dba9c24e71243f0',1,'std::operator!=(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2855896e6ac169748344ed4e2f064ccb',1,'std::operator!=(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e9b319feda06c3f9bbc8c501d7ed5c',1,'std::operator!=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga223f7056b37b325f9d70eda843982dff',1,'std::operator!=(const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__lhs, const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga26b97c6b57337790d75c65c39461d57b',1,'std::operator!=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a376c99e0db4e24c69c2beecd6c11b54e',1,'std::operator!=(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c4c0391a3cd864c981a2752bbb39e87',1,'std::operator!=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c5fbbe825fb3b00793f87d5b0f84b37',1,'std::operator!=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga8ad332f998832aa3bbf426abf441c34a',1,'std::operator!=(const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__lhs, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeffd353ea0720cf2338ac2cd23511b9f',1,'std::operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafd4ac060b48dc528864dcb79b7ac47b9',1,'std::operator!=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae4e62dff9be77e98ba29da34c0eee1b7',1,'std::operator!=(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6b5d199f9e89bfca5738b76671a4118b',1,'std::operator!=(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4a40078467f136b65820875414060d72',1,'std::operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga47c5a5d9835e00a60a76f4be7ea0f671',1,'std::operator!=(const std::shuffle_order_engine< _RandomNumberEngine, __k > &__lhs, const std::shuffle_order_engine< _RandomNumberEngine, __k > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gaca2a091ac2ef5b09deba9d1d185b16ad',1,'std::operator!=(const std::uniform_int_distribution< _IntType > &__d1, const std::uniform_int_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa8e4871fc2d47ad1f14e43949b9ce938',1,'std::operator!=(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gae4180334ebfbfbbae6f1f9901819a52e',1,'std::operator!=(const std::uniform_real_distribution< _IntType > &__d1, const std::uniform_real_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gade5eaebb40897ed5c453b3d1ef9ee18d',1,'std::operator!=(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a44ba4a39615cc57e58325da2c9a2372c',1,'std::operator!=(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga227eec7c437a7d893172e4387a0fb041',1,'std::operator!=(const std::normal_distribution< _RealType > &__d1, const std::normal_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a01fe16a0529fecdacda453c5cb1ce28a',1,'std::operator!=(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga611caefadf0614ec3e3a5bd8a95c11ac',1,'std::operator!=(const std::lognormal_distribution< _RealType > &__d1, const std::lognormal_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gafdf8a737eaa64e171fd0617603e7a6a7',1,'std::operator!=(const std::gamma_distribution< _RealType > &__d1, const std::gamma_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gac4dbdb98454ba9eac4efedb236380fff',1,'std::operator!=(const std::chi_squared_distribution< _RealType > &__d1, const std::chi_squared_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gaf8d44ddbae75bc9aac07aca501130b3a',1,'std::operator!=(const std::cauchy_distribution< _RealType > &__d1, const std::cauchy_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabeee8cc21eaf2d1ac14d819e56e933ee',1,'std::operator!=(const std::fisher_f_distribution< _RealType > &__d1, const std::fisher_f_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga9f65157c0c5e6316e415b7fbf5edbad4',1,'std::operator!=(const std::student_t_distribution< _RealType > &__d1, const std::student_t_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga1b42c0c69b003733630addb17455e78c',1,'std::operator!=(const std::bernoulli_distribution &__d1, const std::bernoulli_distribution &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga03255c2d29292408f9e417d8c19749d5',1,'std::operator!=(const std::binomial_distribution< _IntType > &__d1, const std::binomial_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#gada2797560998107294e60ece46615d73',1,'std::operator!=(const std::geometric_distribution< _IntType > &__d1, const std::geometric_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga0ecd009cd763508bbac68e62a14fa73c',1,'std::operator!=(const std::negative_binomial_distribution< _IntType > &__d1, const std::negative_binomial_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga16e064b3a8822c1a5b84e0b146b2a701',1,'std::operator!=(const std::poisson_distribution< _IntType > &__d1, const std::poisson_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gadb6734dde139796b0c17ab7da2092000',1,'std::operator!=(const std::exponential_distribution< _RealType > &__d1, const std::exponential_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga93a5f8cbd4387728796f825a8004f3fe',1,'std::operator!=(const std::weibull_distribution< _RealType > &__d1, const std::weibull_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga7cb0e95ae2658e8fbce52e9b83969955',1,'std::operator!=(const std::extreme_value_distribution< _RealType > &__d1, const std::extreme_value_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gaf7323b91cdc741135f4099930580987b',1,'std::operator!=(const std::discrete_distribution< _IntType > &__d1, const std::discrete_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga1c4c402db457c46e730ba427efda1f5a',1,'std::operator!=(const std::piecewise_constant_distribution< _RealType > &__d1, const std::piecewise_constant_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga34f4ca07d82381cbfd41b4563b5f265e',1,'std::operator!=(const std::piecewise_linear_distribution< _RealType > &__d1, const std::piecewise_linear_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9551f72d5a20e1b3db6d73876b71be9c',1,'std::operator!=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad109463a06be6ce8e32bd270cc92e7c8',1,'std::operator!=(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5cc85385236f8a6157f148fcf2505196',1,'std::operator!=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga73a0309c22f804987d01e41c3af8d953',1,'std::operator!=(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga4f04509aa5b848bb961d6c4898fc8ee6',1,'std::operator!=(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga05e38fe09ca2ceb867e8cbaf0df2d43b',1,'std::operator!=(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#a90a8bcb2378458899b902c6eb8834bd2',1,'std::rel_ops::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga2b4bf8c35aa9cd820d1bc042accb8687',1,'std::tr2::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga1b42c0c69b003733630addb17455e78c',1,'operator!=(const std::bernoulli_distribution &__d1, const std::bernoulli_distribution &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga03255c2d29292408f9e417d8c19749d5',1,'operator!=(const std::binomial_distribution< _IntType > &__d1, const std::binomial_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#gada2797560998107294e60ece46615d73',1,'operator!=(const std::geometric_distribution< _IntType > &__d1, const std::geometric_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga0ecd009cd763508bbac68e62a14fa73c',1,'operator!=(const std::negative_binomial_distribution< _IntType > &__d1, const std::negative_binomial_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga73a0309c22f804987d01e41c3af8d953',1,'operator!=(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga4f04509aa5b848bb961d6c4898fc8ee6',1,'operator!=(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga05e38fe09ca2ceb867e8cbaf0df2d43b',1,'operator!=(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga2b4bf8c35aa9cd820d1bc042accb8687',1,'operator!=(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga51a6d053b3eb004ee172b8e7ef066854',1,'operator!=(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga227eec7c437a7d893172e4387a0fb041',1,'operator!=(const std::normal_distribution< _RealType > &__d1, const std::normal_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga611caefadf0614ec3e3a5bd8a95c11ac',1,'operator!=(const std::lognormal_distribution< _RealType > &__d1, const std::lognormal_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gafdf8a737eaa64e171fd0617603e7a6a7',1,'operator!=(const std::gamma_distribution< _RealType > &__d1, const std::gamma_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gac4dbdb98454ba9eac4efedb236380fff',1,'operator!=(const std::chi_squared_distribution< _RealType > &__d1, const std::chi_squared_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gaf8d44ddbae75bc9aac07aca501130b3a',1,'operator!=(const std::cauchy_distribution< _RealType > &__d1, const std::cauchy_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabeee8cc21eaf2d1ac14d819e56e933ee',1,'operator!=(const std::fisher_f_distribution< _RealType > &__d1, const std::fisher_f_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga9f65157c0c5e6316e415b7fbf5edbad4',1,'operator!=(const std::student_t_distribution< _RealType > &__d1, const std::student_t_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga16e064b3a8822c1a5b84e0b146b2a701',1,'operator!=(const std::poisson_distribution< _IntType > &__d1, const std::poisson_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gadb6734dde139796b0c17ab7da2092000',1,'operator!=(const std::exponential_distribution< _RealType > &__d1, const std::exponential_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga93a5f8cbd4387728796f825a8004f3fe',1,'operator!=(const std::weibull_distribution< _RealType > &__d1, const std::weibull_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga7cb0e95ae2658e8fbce52e9b83969955',1,'operator!=(const std::extreme_value_distribution< _RealType > &__d1, const std::extreme_value_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gaf7323b91cdc741135f4099930580987b',1,'operator!=(const std::discrete_distribution< _IntType > &__d1, const std::discrete_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga1c4c402db457c46e730ba427efda1f5a',1,'operator!=(const std::piecewise_constant_distribution< _RealType > &__d1, const std::piecewise_constant_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga34f4ca07d82381cbfd41b4563b5f265e',1,'operator!=(const std::piecewise_linear_distribution< _RealType > &__d1, const std::piecewise_linear_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#gafb9c9578afd0299fc357581cb848f2fd',1,'operator!=(const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__lhs, const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga08598cac266ed03507603ca6d6c27ce2',1,'operator!=(const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__lhs, const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga58cddddd716e5fe8d9ef54732399b68f',1,'operator!=(const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__lhs, const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga223f7056b37b325f9d70eda843982dff',1,'operator!=(const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__lhs, const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga8ad332f998832aa3bbf426abf441c34a',1,'operator!=(const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__lhs, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga47c5a5d9835e00a60a76f4be7ea0f671',1,'operator!=(const std::shuffle_order_engine< _RandomNumberEngine, __k > &__lhs, const std::shuffle_order_engine< _RandomNumberEngine, __k > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e9b319feda06c3f9bbc8c501d7ed5c',1,'operator!=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga26b97c6b57337790d75c65c39461d57b',1,'operator!=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c4c0391a3cd864c981a2752bbb39e87',1,'operator!=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c5fbbe825fb3b00793f87d5b0f84b37',1,'operator!=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeffd353ea0720cf2338ac2cd23511b9f',1,'operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafd4ac060b48dc528864dcb79b7ac47b9',1,'operator!=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4a40078467f136b65820875414060d72',1,'operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gade5eaebb40897ed5c453b3d1ef9ee18d',1,'operator!=(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gaca2a091ac2ef5b09deba9d1d185b16ad',1,'operator!=(const std::uniform_int_distribution< _IntType > &__d1, const std::uniform_int_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gae4180334ebfbfbbae6f1f9901819a52e',1,'operator!=(const std::uniform_real_distribution< _IntType > &__d1, const std::uniform_real_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga226dae1d9406b9c3804f20d31c15e21a',1,'operator!=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], + ['operator_25_305',['operator%',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6ec4cce27f5f5c22c51fd8923d0f11',1,'cv::softdouble::operator%()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga69f4dbc0a0eace2d056676b41ca65ff2',1,'cv::softfloat::operator%()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa37b11432b1ebde054af826f340a2c31',1,'cv::cudev::operator%(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab31dfd9be961e597a6ff20fe16aa442b',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga773b0b2650985c05a19fc3b2cea02157',1,'cv::cudev::operator%(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e04cff3e3f4dc32f4ad6f4ea1a175f1',1,'cv::cudev::operator%(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b8b1d46430656d69ace43bf63ef5a03',1,'cv::cudev::operator%(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9aa960339addec61dae59f72ad661f6',1,'cv::cudev::operator%(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59fd9fd64abbdbf6d02111258ff3ee3a',1,'cv::cudev::operator%(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dcc4a1f5610061e0994d8554cfc765b',1,'cv::cudev::operator%(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6093692666282b857f5c312c9669def',1,'cv::cudev::operator%(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9290539128e5d0844f4480b49b3d7088',1,'cv::cudev::operator%(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9373b5425bc87bbf899c139216f9a60a',1,'cv::cudev::operator%(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82bdb4bd976961e8077c200d91a371e3',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d5639fedbfd3ea5fae538d1ccbb97f4',1,'cv::cudev::operator%(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga761216132a87e3c512b66743403bd25e',1,'cv::cudev::operator%(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4a930fbaafd0bef775d17c39a71fc97',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa27152eb3298e3345232dd01c77c0d',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57c116145cb62d4a4027f9639145aa45',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb82ed401680a151f1d811f79c907687',1,'cv::cudev::operator%(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20f538ce841c4168ea7b676bc4d721ce',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea561c006efad0fe66fb54961baf414f',1,'cv::cudev::operator%(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74bf8c1b04c651db7c598cf7064b763',1,'cv::cudev::operator%(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5314568374d8a1d07ca11c4bb88047c',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7714be790d76153dbdc8d751a943bc',1,'cv::cudev::operator%(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d4e175fcb53cd7926bc3787754faf86',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga69f4dbc0a0eace2d056676b41ca65ff2',1,'operator%(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6ec4cce27f5f5c22c51fd8923d0f11',1,'operator%(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa37b11432b1ebde054af826f340a2c31',1,'operator%(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab31dfd9be961e597a6ff20fe16aa442b',1,'operator%(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga773b0b2650985c05a19fc3b2cea02157',1,'operator%(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e04cff3e3f4dc32f4ad6f4ea1a175f1',1,'operator%(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b8b1d46430656d69ace43bf63ef5a03',1,'operator%(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9aa960339addec61dae59f72ad661f6',1,'operator%(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59fd9fd64abbdbf6d02111258ff3ee3a',1,'operator%(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dcc4a1f5610061e0994d8554cfc765b',1,'operator%(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6093692666282b857f5c312c9669def',1,'operator%(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9290539128e5d0844f4480b49b3d7088',1,'operator%(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9373b5425bc87bbf899c139216f9a60a',1,'operator%(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82bdb4bd976961e8077c200d91a371e3',1,'operator%(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d5639fedbfd3ea5fae538d1ccbb97f4',1,'operator%(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga761216132a87e3c512b66743403bd25e',1,'operator%(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4a930fbaafd0bef775d17c39a71fc97',1,'operator%(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa27152eb3298e3345232dd01c77c0d',1,'operator%(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57c116145cb62d4a4027f9639145aa45',1,'operator%(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb82ed401680a151f1d811f79c907687',1,'operator%(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20f538ce841c4168ea7b676bc4d721ce',1,'operator%(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea561c006efad0fe66fb54961baf414f',1,'operator%(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74bf8c1b04c651db7c598cf7064b763',1,'operator%(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5314568374d8a1d07ca11c4bb88047c',1,'operator%(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7714be790d76153dbdc8d751a943bc',1,'operator%(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d4e175fcb53cd7926bc3787754faf86',1,'operator%(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)']]], + ['operator_25_3d_306',['operator%=',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae22a90109adc61a7fba881c7f495002f',1,'cv::softdouble::operator%=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4bd168a6fe89d0016b05917d2c067e00',1,'cv::softfloat::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga707e141e760766ca9cbdb6be26941cd4',1,'std::gslice_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaec955c90f1d087dd1a6a2bd41a5cea7a',1,'std::indirect_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa321a7c18f23aae720cdd059ea38fcc2',1,'std::mask_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga51b2370973ce4cfa93b21428c23e3da0',1,'std::slice_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga64fd546424cb6eb21396e7049fb2c17e',1,'std::valarray::operator%=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc5edf2598de6c9bbfe67c8cdc7ff3ab',1,'std::valarray::operator%=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga64fd546424cb6eb21396e7049fb2c17e',1,'valarray< size_t >::operator%=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc5edf2598de6c9bbfe67c8cdc7ff3ab',1,'valarray< size_t >::operator%=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4bd168a6fe89d0016b05917d2c067e00',1,'operator%=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae22a90109adc61a7fba881c7f495002f',1,'operator%=(const softdouble &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga707e141e760766ca9cbdb6be26941cd4',1,'operator%=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga64fd546424cb6eb21396e7049fb2c17e',1,'operator%=(const _Tp &)(Global Namespace)']]], + ['operator_26_307',['operator&',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad5ca0810ca85918075da95a79d9a97f7',1,'cv::MatExpr::operator&(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac2374f3eaff03e88ed89e166a68d2ae0',1,'cv::MatExpr::operator&(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2a9d86f1b3e1c8840fbcdaedc357c3dc',1,'cv::MatExpr::operator&(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abdc64797e9de5a15144a9c6faff33638',1,'cv::MatExpr::operator&(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab86886f75e72d222c79be0eef13e54ad',1,'cv::MatExpr::operator&(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad5ca0810ca85918075da95a79d9a97f7',1,'cv::MatExpr::operator&(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac2374f3eaff03e88ed89e166a68d2ae0',1,'cv::MatExpr::operator&(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2a9d86f1b3e1c8840fbcdaedc357c3dc',1,'cv::MatExpr::operator&(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abdc64797e9de5a15144a9c6faff33638',1,'cv::MatExpr::operator&(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab86886f75e72d222c79be0eef13e54ad',1,'cv::MatExpr::operator&(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6957bb19d507c40a6915ddd22d1249c4',1,'cv::operator&()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2824fbead5dd62215b4a3962cd3265a3',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac81e02d2c96e3a90c65ce87da156d271',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga144767d1bb4daf6ea0fda36e2e20d4ca',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322dc9a03abc6081db6a879167ebd0c4',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c02de846f3e7774b67e6cb212f91649',1,'cv::cudev::operator&(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691cca0881f07410c194b6b1026a77fb',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e44f3fd51a9f96cc64728aa9c30b0e',1,'cv::cudev::operator&(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd9a0060a95f7eaa54e4de45114028ba',1,'cv::cudev::operator&(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5998775c6f8394bae10ff602c588608',1,'cv::cudev::operator&(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f774843bd845f4bc86e06bdb6c31408',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga238c55671d39087ce44545a5ed98ab1c',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab70b9ac4715868342622dd46f9d29d6a',1,'cv::cudev::operator&(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab73b7952cc39f426b985c670ce7f5b52',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8eae30f62afa2a06307185a43725c74',1,'cv::cudev::operator&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga094b70ca656ab78b3b1f781f929f7567',1,'cv::cudev::operator&(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0913f4f62618507ffc8c0d16251044cd',1,'cv::cudev::operator&(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86dc7c80ee41020ef9ff3b62ae4a2cb6',1,'cv::cudev::operator&(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e6bf0498079e6b9f44052db5b1e89',1,'cv::cudev::operator&(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3476659b715cb17d4c7cb0e217b803d',1,'cv::cudev::operator&(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8498963f3694cb7e5559c1fa089122e',1,'cv::cudev::operator&(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1715d8f7390bd9637882e80d266d8962',1,'cv::cudev::operator&(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad955789a18991c3c601fb6d95cdde9d9',1,'cv::cudev::operator&(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6189769261ab09d9f2f88b0d95d9b69c',1,'cv::cudev::operator&(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47b903733bfaf612b130ab5feaa4e834',1,'cv::cudev::operator&(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6680357b706655b3d4f59ebf6cde1bda',1,'cv::cudev::operator&(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga410ee41519d0e468f977064eca80ca6b',1,'cv::cudev::operator&(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga933b51f3537cb5bd2ca304032f702301',1,'cv::cudev::operator&(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3d2a81a49a5b4ae71bea0e1086650e5',1,'cv::cudev::operator&(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f515f625c04355b920763fbb60934f1',1,'cv::cudev::operator&(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1433b28090a0d04a08045f8de4fecce6',1,'cv::cudev::operator&(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga142e290d05fe7b33f550490478e6bf1c',1,'cv::cudev::operator&(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3956877ec91ef9b8bfd3b4cdf9e7834',1,'cv::cudev::operator&(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d052d31f5b99e648bec17eabcf72643',1,'cv::cudev::operator&(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga447adc88942acc85e431fb7c02584d25',1,'cv::cudev::operator&(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9c66db9a9cfaea6024241e8b1a6acd',1,'cv::cudev::operator&(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d8637568a82c8c300778bd702219d74',1,'cv::cudev::operator&(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga020bb49349993c9d1b6088426f81dfce',1,'cv::cudev::operator&(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50d73894dfb821ab9e3d7aefafed6075',1,'cv::cudev::operator&(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5585ad32954a8f0720a5d88668161ff',1,'cv::cudev::operator&(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7902b60973c6adc297c83152ac0806',1,'cv::cudev::operator&(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0318ec2367da1e372fd5e28b1eab218b',1,'cv::cudev::operator&(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac701681464db5140bc0fab9835f95115',1,'cv::cudev::operator&(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17af2a172ba1fa5938a093c4f9c0eac5',1,'cv::cudev::operator&(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0b49b7d04484f831a731783656099d2',1,'cv::cudev::operator&(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75427aad0e6d9c3c2d6fa9cb246c227d',1,'cv::cudev::operator&(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64f469db78287435cc118baca7fc9a59',1,'cv::cudev::operator&(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44adf7d1bca7f3db25e94fc301c7d678',1,'cv::cudev::operator&(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69834e5b601a5b3bcd816f707b7b3b39',1,'cv::cudev::operator&(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b9761105bb7f9de7916d7d18c7b59bc',1,'cv::cudev::operator&(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab3eb409493f1177554f7cd8a1606318',1,'cv::cudev::operator&(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0eeb6595b46265a3e9bdf9132960798',1,'cv::cudev::operator&(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7977db362f2714454a13ce8be3cf7d35',1,'cv::cudev::operator&(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa25aab84c9af7fcb275c62366cda31ff',1,'cv::cudev::operator&(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd225b01b0b95ad01a57d361b5378ad9',1,'cv::cudev::operator&(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a57e28ab5789a6ab5e3763d7eae3a5e',1,'cv::cudev::operator&(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09703b8694475c3f60d87240ead7ab9c',1,'cv::cudev::operator&(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9250d1f6ecee8ad1dc4b7ca2f8119d7a',1,'cv::cudev::operator&(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga600dc4708da63b278579de8250268fda',1,'cv::cudev::operator&(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12da3f8eecbcdcbdfda3b88b0656de26',1,'cv::cudev::operator&(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72c946da7805977984f0c3e67805271f',1,'cv::cudev::operator&(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12cbff5375b5fe75cb11aa1ceec29e12',1,'cv::cudev::operator&(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e56c435219a48922c9e0bc4dbae5731',1,'cv::cudev::operator&(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f3310022e46b2058670f9d6d9299f39',1,'cv::cudev::operator&(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2d39ebbf206189dc22406a1a2fed139',1,'cv::cudev::operator&(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga068e477cd2843f7b78897fa476592131',1,'cv::cudev::operator&(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51bb0adc5368740ed76777f54a476874',1,'cv::cudev::operator&(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2978c32bb65ec46ca1d351ed7a3eae6',1,'cv::cudev::operator&(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87142039aff3429c8a5a07e52a30f857',1,'cv::cudev::operator&(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cf577b65c982883d6e83281db193dee',1,'cv::cudev::operator&(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8427d79ce048b5397fd13acfe46b0cb8',1,'cv::cudev::operator&(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c00c23cee32f10298bafb1f26393f7b',1,'cv::cudev::operator&(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68e97414257334444f9b1238164108f9',1,'cv::cudev::operator&(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ffa9ba4cd1b5284df92cb84f52d893f',1,'cv::cudev::operator&(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d94fd3ad9493292e1015a141cb3b75',1,'cv::cudev::operator&(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c39d2a806d68167e5bec9b1bef88fa5',1,'cv::cudev::operator&(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa46e182b2a2cf5fb4e36d9872ef0f643',1,'cv::cudev::operator&(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d014dc5b0c60ccbee2f4818a6b2057b',1,'cv::cudev::operator&(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2b5c40d3f569407c9a67bfc1e6b7e89',1,'cv::cudev::operator&(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga099252f9ea434dc03ebd12a8d6ad446e',1,'cv::cudev::operator&(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae242e51d22b353b9ddcff233be97be6f',1,'cv::cudev::operator&(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17e0ec430072e4254a93b539475a5aa1',1,'cv::cudev::operator&(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga883ec5e2401d4cba39d1e4a61b968d94',1,'cv::cudev::operator&(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf31f6fafe2187bc62231e4d0af623cad',1,'cv::cudev::operator&(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc1e6f9244edefd36feff70a5eb86150',1,'cv::cudev::operator&(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab69568bca24e4407e2658ac08a843681',1,'cv::cudev::operator&(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04720d9d8f413cfb21fcb97e53435911',1,'cv::cudev::operator&(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86170e2b7b037f8d980d18f876e72c8d',1,'cv::cudev::operator&(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0707c9dedfd86a692e37e96fe1661ca',1,'cv::cudev::operator&(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6cf168e908a747b46770c3c49cc239',1,'cv::cudev::operator&(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9886a421fb77d7c4b6c69fb3265e3a5b',1,'cv::cudev::operator&(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac32cf95373924bf8cecb00934eeb13ce',1,'cv::cudev::operator&(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac45d05b0b072454d8a1e434bc31a2622',1,'cv::cudev::operator&(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f62603bc29e2ad5f85228039996f9f',1,'cv::cudev::operator&(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf63f98e35a6ecd4b52e32c00aec377ce',1,'cv::cudev::operator&(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga167cfb86156279d9446b2428dfcdf459',1,'cv::cudev::operator&(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19d008f7753dd3651d38cf48c2fef06c',1,'cv::cudev::operator&(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ab76078d3f1909db7086b0360c9fc8b6d',1,'cv::gapi::own::operator&()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6957bb19d507c40a6915ddd22d1249c4',1,'operator&(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2824fbead5dd62215b4a3962cd3265a3',1,'operator&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac81e02d2c96e3a90c65ce87da156d271',1,'operator&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga144767d1bb4daf6ea0fda36e2e20d4ca',1,'operator&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322dc9a03abc6081db6a879167ebd0c4',1,'operator&(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c02de846f3e7774b67e6cb212f91649',1,'operator&(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691cca0881f07410c194b6b1026a77fb',1,'operator&(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e44f3fd51a9f96cc64728aa9c30b0e',1,'operator&(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd9a0060a95f7eaa54e4de45114028ba',1,'operator&(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5998775c6f8394bae10ff602c588608',1,'operator&(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f774843bd845f4bc86e06bdb6c31408',1,'operator&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga238c55671d39087ce44545a5ed98ab1c',1,'operator&(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab70b9ac4715868342622dd46f9d29d6a',1,'operator&(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab73b7952cc39f426b985c670ce7f5b52',1,'operator&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8eae30f62afa2a06307185a43725c74',1,'operator&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga094b70ca656ab78b3b1f781f929f7567',1,'operator&(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0913f4f62618507ffc8c0d16251044cd',1,'operator&(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86dc7c80ee41020ef9ff3b62ae4a2cb6',1,'operator&(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e6bf0498079e6b9f44052db5b1e89',1,'operator&(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3476659b715cb17d4c7cb0e217b803d',1,'operator&(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8498963f3694cb7e5559c1fa089122e',1,'operator&(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1715d8f7390bd9637882e80d266d8962',1,'operator&(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad955789a18991c3c601fb6d95cdde9d9',1,'operator&(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6189769261ab09d9f2f88b0d95d9b69c',1,'operator&(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47b903733bfaf612b130ab5feaa4e834',1,'operator&(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6680357b706655b3d4f59ebf6cde1bda',1,'operator&(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga410ee41519d0e468f977064eca80ca6b',1,'operator&(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga933b51f3537cb5bd2ca304032f702301',1,'operator&(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3d2a81a49a5b4ae71bea0e1086650e5',1,'operator&(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f515f625c04355b920763fbb60934f1',1,'operator&(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1433b28090a0d04a08045f8de4fecce6',1,'operator&(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga142e290d05fe7b33f550490478e6bf1c',1,'operator&(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3956877ec91ef9b8bfd3b4cdf9e7834',1,'operator&(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d052d31f5b99e648bec17eabcf72643',1,'operator&(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga447adc88942acc85e431fb7c02584d25',1,'operator&(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9c66db9a9cfaea6024241e8b1a6acd',1,'operator&(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d8637568a82c8c300778bd702219d74',1,'operator&(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga020bb49349993c9d1b6088426f81dfce',1,'operator&(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50d73894dfb821ab9e3d7aefafed6075',1,'operator&(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5585ad32954a8f0720a5d88668161ff',1,'operator&(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7902b60973c6adc297c83152ac0806',1,'operator&(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0318ec2367da1e372fd5e28b1eab218b',1,'operator&(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac701681464db5140bc0fab9835f95115',1,'operator&(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17af2a172ba1fa5938a093c4f9c0eac5',1,'operator&(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0b49b7d04484f831a731783656099d2',1,'operator&(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75427aad0e6d9c3c2d6fa9cb246c227d',1,'operator&(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64f469db78287435cc118baca7fc9a59',1,'operator&(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44adf7d1bca7f3db25e94fc301c7d678',1,'operator&(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69834e5b601a5b3bcd816f707b7b3b39',1,'operator&(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b9761105bb7f9de7916d7d18c7b59bc',1,'operator&(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab3eb409493f1177554f7cd8a1606318',1,'operator&(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0eeb6595b46265a3e9bdf9132960798',1,'operator&(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7977db362f2714454a13ce8be3cf7d35',1,'operator&(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa25aab84c9af7fcb275c62366cda31ff',1,'operator&(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd225b01b0b95ad01a57d361b5378ad9',1,'operator&(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a57e28ab5789a6ab5e3763d7eae3a5e',1,'operator&(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09703b8694475c3f60d87240ead7ab9c',1,'operator&(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9250d1f6ecee8ad1dc4b7ca2f8119d7a',1,'operator&(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga600dc4708da63b278579de8250268fda',1,'operator&(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12da3f8eecbcdcbdfda3b88b0656de26',1,'operator&(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72c946da7805977984f0c3e67805271f',1,'operator&(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12cbff5375b5fe75cb11aa1ceec29e12',1,'operator&(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e56c435219a48922c9e0bc4dbae5731',1,'operator&(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f3310022e46b2058670f9d6d9299f39',1,'operator&(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2d39ebbf206189dc22406a1a2fed139',1,'operator&(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga068e477cd2843f7b78897fa476592131',1,'operator&(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51bb0adc5368740ed76777f54a476874',1,'operator&(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2978c32bb65ec46ca1d351ed7a3eae6',1,'operator&(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87142039aff3429c8a5a07e52a30f857',1,'operator&(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cf577b65c982883d6e83281db193dee',1,'operator&(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8427d79ce048b5397fd13acfe46b0cb8',1,'operator&(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c00c23cee32f10298bafb1f26393f7b',1,'operator&(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68e97414257334444f9b1238164108f9',1,'operator&(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ffa9ba4cd1b5284df92cb84f52d893f',1,'operator&(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d94fd3ad9493292e1015a141cb3b75',1,'operator&(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c39d2a806d68167e5bec9b1bef88fa5',1,'operator&(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa46e182b2a2cf5fb4e36d9872ef0f643',1,'operator&(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d014dc5b0c60ccbee2f4818a6b2057b',1,'operator&(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2b5c40d3f569407c9a67bfc1e6b7e89',1,'operator&(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga099252f9ea434dc03ebd12a8d6ad446e',1,'operator&(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae242e51d22b353b9ddcff233be97be6f',1,'operator&(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17e0ec430072e4254a93b539475a5aa1',1,'operator&(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga883ec5e2401d4cba39d1e4a61b968d94',1,'operator&(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf31f6fafe2187bc62231e4d0af623cad',1,'operator&(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc1e6f9244edefd36feff70a5eb86150',1,'operator&(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab69568bca24e4407e2658ac08a843681',1,'operator&(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04720d9d8f413cfb21fcb97e53435911',1,'operator&(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86170e2b7b037f8d980d18f876e72c8d',1,'operator&(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0707c9dedfd86a692e37e96fe1661ca',1,'operator&(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6cf168e908a747b46770c3c49cc239',1,'operator&(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9886a421fb77d7c4b6c69fb3265e3a5b',1,'operator&(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac32cf95373924bf8cecb00934eeb13ce',1,'operator&(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac45d05b0b072454d8a1e434bc31a2622',1,'operator&(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f62603bc29e2ad5f85228039996f9f',1,'operator&(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf63f98e35a6ecd4b52e32c00aec377ce',1,'operator&(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga167cfb86156279d9446b2428dfcdf459',1,'operator&(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19d008f7753dd3651d38cf48c2fef06c',1,'operator&(const uint4 &a, uint s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0bad6c26bf52fd395038f073e09423b9',1,'std::operator&()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#aa181d58777df9e46fdd8b6cf08dd12c3',1,'std::regex_constants::operator&(syntax_option_type __a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a91f43c51d82f4484019c321d420a9fa3',1,'std::regex_constants::operator&(match_flag_type __a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gacc832712a19ae288e2b01ba85bee3d5a',1,'std::tr2::operator&()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gacc832712a19ae288e2b01ba85bee3d5a',1,'operator&()(Global Namespace)']]], + ['operator_26_26_308',['operator&&',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9daa85a8c304bfe871adc47da30a4075',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c3601d795120192cba3966eae171f10',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3bdc6d15e263a0dabfd93f5c2e4b65f',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad06b1219c0854f5f7bb80f38df9d8cb4',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga897646556f5a3a133b41494b371b484b',1,'cv::cudev::operator&&(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa883a73a52c65d1e648c2f8844352ceb',1,'cv::cudev::operator&&(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468fd922ef425cca9d9ec40fc702cc52',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2816ac7d00137b8a6631c13355bbf84d',1,'cv::cudev::operator&&(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3a1b877260a04e1c1664908d89f87c1',1,'cv::cudev::operator&&(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51ac89a7446501931038d95fca430398',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987ac6dfee9f13d1365e8741da3ea37a',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace124f27b31537a2901a0dfa2c5a52ba',1,'cv::cudev::operator&&(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508b443e9fd9a0b93d9ae46f85a64edb',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2048cae02db953f223509133d6c274da',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6e25ae76fb3499ae0e9655b6fa6c5d4',1,'cv::cudev::operator&&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc7b300e441c12d3f877fbba0f640f91',1,'cv::cudev::operator&&(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6df462ce5ffc9b3ee0fe42b1fc3bfb0f',1,'cv::cudev::operator&&(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfa8ff8614d4e00b93ee2d759819a4cb',1,'cv::cudev::operator&&(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dd173482aba8974fc0592b0c25f3c2',1,'cv::cudev::operator&&(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac76e6288a150f76f61a2824840344e7b',1,'cv::cudev::operator&&(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9be5fb383bfaf67c9bc2af53e6ae445',1,'cv::cudev::operator&&(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cee20c36d3655a18dae9c643a08db82',1,'cv::cudev::operator&&(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65a91568d8a8069dbd33c5f48ef8e691',1,'cv::cudev::operator&&(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac51b458c5da2918473fee75cb6e10955',1,'cv::cudev::operator&&(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56cf2aa63abdf862d31098458753edbb',1,'cv::cudev::operator&&(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dc1d206c05395102ddc5a1a287461e',1,'cv::cudev::operator&&(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990451138951363139dd592adce0ff78',1,'cv::cudev::operator&&(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae22e605f6aff9ef0a408e0caa81925ec',1,'cv::cudev::operator&&(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc48e8ac73e455ef8bd4b6f830280f09',1,'cv::cudev::operator&&(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a58600dc51ddd5a9609e2ebd5e2fbca',1,'cv::cudev::operator&&(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e50d6f24de8bf739a28d4f25dcc791b',1,'cv::cudev::operator&&(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa394cdb2ec6fa3211a4a76c8dd2d849e',1,'cv::cudev::operator&&(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7c5a779467e224a84de95a4cf906ae4',1,'cv::cudev::operator&&(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9a6d566256f6915d183f3a8ac8b85ba',1,'cv::cudev::operator&&(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff4f4526f76a68ac06eadc1b0a6be0c',1,'cv::cudev::operator&&(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a9ddd3b6a9e3f208a416bed9990c4e',1,'cv::cudev::operator&&(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755ae4826d5870d832393255b0922921',1,'cv::cudev::operator&&(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ba3e08f2b0c31afc32421751f1f80d',1,'cv::cudev::operator&&(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f917aa69f90085189ec9e06612bfa07',1,'cv::cudev::operator&&(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7916e11ea81ef8251fe45d086c96be20',1,'cv::cudev::operator&&(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b05c87a1d20f8b880ab6cbda2db9bd3',1,'cv::cudev::operator&&(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d8edae6372de657170a6d8503e50546',1,'cv::cudev::operator&&(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga597ef8e3f532caf8cf102750203625dc',1,'cv::cudev::operator&&(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dab250b0b130cd0128d02fec06b4842',1,'cv::cudev::operator&&(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c9e483c92927b8a6ebede43d4413a1',1,'cv::cudev::operator&&(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76c52d8fb9195ffbc8e724038305864f',1,'cv::cudev::operator&&(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf943568be0acae96b5b025b73efec7fb',1,'cv::cudev::operator&&(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5eba7700c8b81b388425b3d0b138c6f',1,'cv::cudev::operator&&(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac16ec172d052e95bbf324345dac02567',1,'cv::cudev::operator&&(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0885c4984c4251641df3bc3f2720ac90',1,'cv::cudev::operator&&(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a132cd81a7e17cdb05f15ed4d04c810',1,'cv::cudev::operator&&(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga784e168129bc4fce6b3f7c17ed5fc70d',1,'cv::cudev::operator&&(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdfe6638006d040dd4c446f2e0a2394',1,'cv::cudev::operator&&(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6376582bf0339f0b9c9388fadc8d8ca4',1,'cv::cudev::operator&&(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafce02da16b670515cf35ac56ef70f550',1,'cv::cudev::operator&&(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga173fe35e9054cb5a39aa6e8880866cda',1,'cv::cudev::operator&&(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e115f94ba7670c47892d29058840e15',1,'cv::cudev::operator&&(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e28550c974cc909cb44d798988cce12',1,'cv::cudev::operator&&(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cc212c7d51a10bcbd8b7f0156160fe3',1,'cv::cudev::operator&&(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec57a07d4d17363ae5e7e387fcea30a0',1,'cv::cudev::operator&&(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f3a4fb3fa1532375e8890053394ab03',1,'cv::cudev::operator&&(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3986bd1d079a19f0f4ec3255a74c748',1,'cv::cudev::operator&&(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f3bd5cbe1e0bf123190c0a600eed871',1,'cv::cudev::operator&&(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9456d12d1542746d8289926ca17494c2',1,'cv::cudev::operator&&(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a553dd9208cba98dba26d25074ea3fc',1,'cv::cudev::operator&&(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9752fe7958a740cea43e4f5bd4f1a15',1,'cv::cudev::operator&&(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaece716a600686f5b9781ec870ea442f0',1,'cv::cudev::operator&&(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4573fd86b5ee0040383fd285235a066d',1,'cv::cudev::operator&&(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75403ae82171c1a3eae6dbeefb12dc02',1,'cv::cudev::operator&&(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31c1bf92bb175a9fa8596c438db86014',1,'cv::cudev::operator&&(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74734139f4f10325d11fe6a9085279e1',1,'cv::cudev::operator&&(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25395032ad06d8e8c445079cb8e9aa42',1,'cv::cudev::operator&&(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6a649ac42b67feb71003beddbacd7f0',1,'cv::cudev::operator&&(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31766171823163be81c9b812569822e6',1,'cv::cudev::operator&&(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2a9aee1a3645f4251ce647c2927d452',1,'cv::cudev::operator&&(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada168ab6107bd0ccfd2bd501f3e277f3',1,'cv::cudev::operator&&(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b4509b995583bc214680c6327af30e0',1,'cv::cudev::operator&&(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8006f3728e9e0df5a7f72765d207b406',1,'cv::cudev::operator&&(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30b7bb6d73291c7482998899eb14d144',1,'cv::cudev::operator&&(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ddc4cbc632339a238fb6d9ed1b9a5ca',1,'cv::cudev::operator&&(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59c31536e15ee1bfcc9e0a2a2babbb44',1,'cv::cudev::operator&&(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4122355804f4d7068d2c3e727f060c69',1,'cv::cudev::operator&&(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56ceb64916924c2b210aeeeea43cb93',1,'cv::cudev::operator&&(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee9ad5547e1a27092cd79622c56ac2b7',1,'cv::cudev::operator&&(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a48ccd60d6b596798654adec10cbda0',1,'cv::cudev::operator&&(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9f44a6c26c30d6a39bc45a623dc6a3',1,'cv::cudev::operator&&(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cb948715ea292618e5672820cebed45',1,'cv::cudev::operator&&(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae559d6cf14a6c96295a07c18a2321b33',1,'cv::cudev::operator&&(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8344d3ce2cc4c18da8df795fad1b52dc',1,'cv::cudev::operator&&(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6253898eb552c062075101942a691a7d',1,'cv::cudev::operator&&(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea4896818580da7de435628d403ce426',1,'cv::cudev::operator&&(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31e5d68382677b0c792f7fa1e545dff8',1,'cv::cudev::operator&&(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18c7b7f2c8ebb8b829ae0bd902548e58',1,'cv::cudev::operator&&(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga944653cf7179a84fc232c65418c805f7',1,'cv::cudev::operator&&(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d7df31c53c8e4dc9e0cadc7af19c732',1,'cv::cudev::operator&&(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0651016efcb1cdcac924fb59ac451c7e',1,'cv::cudev::operator&&(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c62e689f10955a1f4befb6fee373e8',1,'cv::cudev::operator&&(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d63e056e39e0fb89da997f16611a635',1,'cv::cudev::operator&&(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6744338561d677971b9c536a5065ed37',1,'cv::cudev::operator&&(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee44cddc9a95fb7d5fd14c3a904ac916',1,'cv::cudev::operator&&(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9a63465a3fce79c26a75e054f67b0c8',1,'cv::cudev::operator&&(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1418091ec7fc32cf9df83c3b33157652',1,'cv::cudev::operator&&(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f8e32c315622cd29f644906a8fb699c',1,'cv::cudev::operator&&(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b14278109d0129e03a1c122f34a400b',1,'cv::cudev::operator&&(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad24b233b709002378ddab84ebab7b8c1',1,'cv::cudev::operator&&(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7881e75bb7e5519030f9c27966e4bbc9',1,'cv::cudev::operator&&(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab59a4f1aaebaeb0ab30d236cd90ea438',1,'cv::cudev::operator&&(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16e626f8b9952b0a82fd931686d9e98a',1,'cv::cudev::operator&&(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad6bb786a45b9412453e93239972519',1,'cv::cudev::operator&&(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga918585aac4816c3ce968d179cfcfb6c9',1,'cv::cudev::operator&&(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08df2d9887291e206d3f0f42a313a220',1,'cv::cudev::operator&&(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga543d7d06fea6a02e66ecef2710cb7608',1,'cv::cudev::operator&&(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84ee73980b0845219731857a6ea350c1',1,'cv::cudev::operator&&(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ffc399abd2fb9fc96bb9700e5d5ebd',1,'cv::cudev::operator&&(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6287e06b541f138ea8c3ff9744299b2a',1,'cv::cudev::operator&&(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad006a6b3d0f83b95d337925f808bb9a0',1,'cv::cudev::operator&&(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5b87c6df19abe0807b867a8055d7210',1,'cv::cudev::operator&&(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9bf69d4894e48fe280fb7af235ee729',1,'cv::cudev::operator&&(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48663d644513466290e6c1b1467bafdb',1,'cv::cudev::operator&&(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60d7bf69aabe9bbe43a43ebc656471bd',1,'cv::cudev::operator&&(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9daa85a8c304bfe871adc47da30a4075',1,'operator&&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c3601d795120192cba3966eae171f10',1,'operator&&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3bdc6d15e263a0dabfd93f5c2e4b65f',1,'operator&&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad06b1219c0854f5f7bb80f38df9d8cb4',1,'operator&&(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga897646556f5a3a133b41494b371b484b',1,'operator&&(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa883a73a52c65d1e648c2f8844352ceb',1,'operator&&(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468fd922ef425cca9d9ec40fc702cc52',1,'operator&&(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2816ac7d00137b8a6631c13355bbf84d',1,'operator&&(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3a1b877260a04e1c1664908d89f87c1',1,'operator&&(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51ac89a7446501931038d95fca430398',1,'operator&&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987ac6dfee9f13d1365e8741da3ea37a',1,'operator&&(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace124f27b31537a2901a0dfa2c5a52ba',1,'operator&&(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508b443e9fd9a0b93d9ae46f85a64edb',1,'operator&&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2048cae02db953f223509133d6c274da',1,'operator&&(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6e25ae76fb3499ae0e9655b6fa6c5d4',1,'operator&&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc7b300e441c12d3f877fbba0f640f91',1,'operator&&(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6df462ce5ffc9b3ee0fe42b1fc3bfb0f',1,'operator&&(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfa8ff8614d4e00b93ee2d759819a4cb',1,'operator&&(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dd173482aba8974fc0592b0c25f3c2',1,'operator&&(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac76e6288a150f76f61a2824840344e7b',1,'operator&&(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9be5fb383bfaf67c9bc2af53e6ae445',1,'operator&&(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cee20c36d3655a18dae9c643a08db82',1,'operator&&(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65a91568d8a8069dbd33c5f48ef8e691',1,'operator&&(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac51b458c5da2918473fee75cb6e10955',1,'operator&&(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56cf2aa63abdf862d31098458753edbb',1,'operator&&(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dc1d206c05395102ddc5a1a287461e',1,'operator&&(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990451138951363139dd592adce0ff78',1,'operator&&(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae22e605f6aff9ef0a408e0caa81925ec',1,'operator&&(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc48e8ac73e455ef8bd4b6f830280f09',1,'operator&&(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a58600dc51ddd5a9609e2ebd5e2fbca',1,'operator&&(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e50d6f24de8bf739a28d4f25dcc791b',1,'operator&&(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa394cdb2ec6fa3211a4a76c8dd2d849e',1,'operator&&(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7c5a779467e224a84de95a4cf906ae4',1,'operator&&(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9a6d566256f6915d183f3a8ac8b85ba',1,'operator&&(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff4f4526f76a68ac06eadc1b0a6be0c',1,'operator&&(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a9ddd3b6a9e3f208a416bed9990c4e',1,'operator&&(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755ae4826d5870d832393255b0922921',1,'operator&&(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ba3e08f2b0c31afc32421751f1f80d',1,'operator&&(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f917aa69f90085189ec9e06612bfa07',1,'operator&&(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7916e11ea81ef8251fe45d086c96be20',1,'operator&&(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b05c87a1d20f8b880ab6cbda2db9bd3',1,'operator&&(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d8edae6372de657170a6d8503e50546',1,'operator&&(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga597ef8e3f532caf8cf102750203625dc',1,'operator&&(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dab250b0b130cd0128d02fec06b4842',1,'operator&&(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c9e483c92927b8a6ebede43d4413a1',1,'operator&&(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76c52d8fb9195ffbc8e724038305864f',1,'operator&&(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf943568be0acae96b5b025b73efec7fb',1,'operator&&(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5eba7700c8b81b388425b3d0b138c6f',1,'operator&&(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac16ec172d052e95bbf324345dac02567',1,'operator&&(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0885c4984c4251641df3bc3f2720ac90',1,'operator&&(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a132cd81a7e17cdb05f15ed4d04c810',1,'operator&&(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga784e168129bc4fce6b3f7c17ed5fc70d',1,'operator&&(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdfe6638006d040dd4c446f2e0a2394',1,'operator&&(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6376582bf0339f0b9c9388fadc8d8ca4',1,'operator&&(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafce02da16b670515cf35ac56ef70f550',1,'operator&&(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga173fe35e9054cb5a39aa6e8880866cda',1,'operator&&(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e115f94ba7670c47892d29058840e15',1,'operator&&(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e28550c974cc909cb44d798988cce12',1,'operator&&(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cc212c7d51a10bcbd8b7f0156160fe3',1,'operator&&(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec57a07d4d17363ae5e7e387fcea30a0',1,'operator&&(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f3a4fb3fa1532375e8890053394ab03',1,'operator&&(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3986bd1d079a19f0f4ec3255a74c748',1,'operator&&(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f3bd5cbe1e0bf123190c0a600eed871',1,'operator&&(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9456d12d1542746d8289926ca17494c2',1,'operator&&(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a553dd9208cba98dba26d25074ea3fc',1,'operator&&(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9752fe7958a740cea43e4f5bd4f1a15',1,'operator&&(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaece716a600686f5b9781ec870ea442f0',1,'operator&&(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4573fd86b5ee0040383fd285235a066d',1,'operator&&(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75403ae82171c1a3eae6dbeefb12dc02',1,'operator&&(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31c1bf92bb175a9fa8596c438db86014',1,'operator&&(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74734139f4f10325d11fe6a9085279e1',1,'operator&&(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25395032ad06d8e8c445079cb8e9aa42',1,'operator&&(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6a649ac42b67feb71003beddbacd7f0',1,'operator&&(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31766171823163be81c9b812569822e6',1,'operator&&(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2a9aee1a3645f4251ce647c2927d452',1,'operator&&(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada168ab6107bd0ccfd2bd501f3e277f3',1,'operator&&(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b4509b995583bc214680c6327af30e0',1,'operator&&(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8006f3728e9e0df5a7f72765d207b406',1,'operator&&(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30b7bb6d73291c7482998899eb14d144',1,'operator&&(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ddc4cbc632339a238fb6d9ed1b9a5ca',1,'operator&&(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59c31536e15ee1bfcc9e0a2a2babbb44',1,'operator&&(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4122355804f4d7068d2c3e727f060c69',1,'operator&&(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56ceb64916924c2b210aeeeea43cb93',1,'operator&&(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee9ad5547e1a27092cd79622c56ac2b7',1,'operator&&(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a48ccd60d6b596798654adec10cbda0',1,'operator&&(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9f44a6c26c30d6a39bc45a623dc6a3',1,'operator&&(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cb948715ea292618e5672820cebed45',1,'operator&&(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae559d6cf14a6c96295a07c18a2321b33',1,'operator&&(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8344d3ce2cc4c18da8df795fad1b52dc',1,'operator&&(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6253898eb552c062075101942a691a7d',1,'operator&&(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea4896818580da7de435628d403ce426',1,'operator&&(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31e5d68382677b0c792f7fa1e545dff8',1,'operator&&(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18c7b7f2c8ebb8b829ae0bd902548e58',1,'operator&&(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga944653cf7179a84fc232c65418c805f7',1,'operator&&(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d7df31c53c8e4dc9e0cadc7af19c732',1,'operator&&(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0651016efcb1cdcac924fb59ac451c7e',1,'operator&&(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c62e689f10955a1f4befb6fee373e8',1,'operator&&(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d63e056e39e0fb89da997f16611a635',1,'operator&&(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6744338561d677971b9c536a5065ed37',1,'operator&&(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee44cddc9a95fb7d5fd14c3a904ac916',1,'operator&&(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9a63465a3fce79c26a75e054f67b0c8',1,'operator&&(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1418091ec7fc32cf9df83c3b33157652',1,'operator&&(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f8e32c315622cd29f644906a8fb699c',1,'operator&&(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b14278109d0129e03a1c122f34a400b',1,'operator&&(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad24b233b709002378ddab84ebab7b8c1',1,'operator&&(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7881e75bb7e5519030f9c27966e4bbc9',1,'operator&&(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab59a4f1aaebaeb0ab30d236cd90ea438',1,'operator&&(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16e626f8b9952b0a82fd931686d9e98a',1,'operator&&(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad6bb786a45b9412453e93239972519',1,'operator&&(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga918585aac4816c3ce968d179cfcfb6c9',1,'operator&&(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08df2d9887291e206d3f0f42a313a220',1,'operator&&(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga543d7d06fea6a02e66ecef2710cb7608',1,'operator&&(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84ee73980b0845219731857a6ea350c1',1,'operator&&(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ffc399abd2fb9fc96bb9700e5d5ebd',1,'operator&&(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6287e06b541f138ea8c3ff9744299b2a',1,'operator&&(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad006a6b3d0f83b95d337925f808bb9a0',1,'operator&&(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5b87c6df19abe0807b867a8055d7210',1,'operator&&(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9bf69d4894e48fe280fb7af235ee729',1,'operator&&(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48663d644513466290e6c1b1467bafdb',1,'operator&&(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60d7bf69aabe9bbe43a43ebc656471bd',1,'operator&&(double s, const double2 &b)(Global Namespace)']]], + ['operator_26_3d_309',['operator&=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aaeeeb77b0bef34eb4eacb3905e09a561',1,'std::bitset::operator&=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aaeeeb77b0bef34eb4eacb3905e09a561',1,'std::bitset::operator&=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaca009c69acad92ea0f2244082487b32b',1,'std::gslice_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9a195965bc454b815b4035618de3f5ba',1,'std::indirect_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga243e78b1748d74ed3d4be27c8839fb87',1,'std::mask_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc4123a878dbaee0b0e8dea7aeb7216c',1,'std::slice_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae775a70aa50343f7e0d12bec75dcdd2b',1,'std::tr2::dynamic_bitset::operator&=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab623bb2bba98884ae7c3eccd227d5459',1,'std::tr2::dynamic_bitset::operator&=(dynamic_bitset &&__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae775a70aa50343f7e0d12bec75dcdd2b',1,'std::tr2::dynamic_bitset::operator&=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab623bb2bba98884ae7c3eccd227d5459',1,'std::tr2::dynamic_bitset::operator&=(dynamic_bitset &&__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6eacabfbf6099e64331966308185f957',1,'std::valarray::operator&=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafc4fe2eb569b9bca46e799f3ecb0609c',1,'std::valarray::operator&=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6eacabfbf6099e64331966308185f957',1,'valarray< size_t >::operator&=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafc4fe2eb569b9bca46e799f3ecb0609c',1,'valarray< size_t >::operator&=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1c36b9548296f20d3382808c82122ca3',1,'cv::operator&=()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#adaba058bb9999abb04506b319aff5011',1,'cv::gapi::own::operator&=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1c36b9548296f20d3382808c82122ca3',1,'operator&=()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a0ac5601f07c5581e7cc3efd6ce6a9d4f',1,'std::regex_constants::operator&=(syntax_option_type &__a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#adf8b32ecec86f9328d9e77ea918d5bd7',1,'std::regex_constants::operator&=(match_flag_type &__a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaca009c69acad92ea0f2244082487b32b',1,'operator&=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6eacabfbf6099e64331966308185f957',1,'operator&=(const _Tp &)(Global Namespace)']]], + ['operator_28_29_310',['operator()',['https://docs.opencv.org/4.2.0/da/d32/structcv_1_1cudev_1_1abs__func.html#a94901ba987a4b13f76d6c512ff67630f',1,'cv::cudev::abs_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/d17/structcv_1_1cudev_1_1abs__func_3_01double_01_4.html#a09324ee98e693e096ffbf16186d54406',1,'cv::cudev::abs_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d75/structcv_1_1cudev_1_1abs__func_3_01float_01_4.html#a61ef7062be465ef121b724f7c612e100',1,'cv::cudev::abs_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d3/dc9/structcv_1_1cudev_1_1abs__func_3_01schar_01_4.html#a33a00f9fd47140d763c362d2d8754ef5',1,'cv::cudev::abs_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d2b/structcv_1_1cudev_1_1abs__func_3_01short_01_4.html#ab273409438d23ecf6a7deee0a1ceb338',1,'cv::cudev::abs_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d6e/structcv_1_1cudev_1_1abs__func_3_01uchar_01_4.html#a087883df9c5e8aa99a6e686a2a42ee30',1,'cv::cudev::abs_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d98/structcv_1_1cudev_1_1abs__func_3_01uint_01_4.html#a6194e5eba6a05ab9fef48ef29855ad22',1,'cv::cudev::abs_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/da7/structcv_1_1cudev_1_1abs__func_3_01ushort_01_4.html#a230f31a23cac7d7b75e8f1b8b32ad1dc',1,'cv::cudev::abs_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/da1/structcv_1_1cudev_1_1absdiff__func.html#ab501011fd7f3950a7db1bff0e6c4f739',1,'cv::cudev::absdiff_func::operator()()'],['https://docs.opencv.org/4.2.0/de/dae/structcv_1_1cudev_1_1acos__func.html#a00573ba47210264bc9812c7e2fbb1676',1,'cv::cudev::acos_func::operator()()'],['https://docs.opencv.org/4.2.0/d0/d62/structcv_1_1cudev_1_1acos__func_3_01double_01_4.html#a35dd825ad75c47ace1929b2b478705cb',1,'cv::cudev::acos_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd0/structcv_1_1cudev_1_1acos__func_3_01float_01_4.html#a72e654a25abffc81ac465c0b62f751ab',1,'cv::cudev::acos_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d4/dc1/structcv_1_1cudev_1_1acos__func_3_01schar_01_4.html#a751cd34b926ea535d1c4ae85115b3ad3',1,'cv::cudev::acos_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d80/structcv_1_1cudev_1_1acos__func_3_01short_01_4.html#ab8a75a695c451fee16cf582bb37be3a7',1,'cv::cudev::acos_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1acos__func_3_01uchar_01_4.html#a41864404742e2b57a5d61bfaedc6930b',1,'cv::cudev::acos_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dc0/structcv_1_1cudev_1_1acos__func_3_01uint_01_4.html#af21480a7802d4fcdb548d815d2732108',1,'cv::cudev::acos_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/de/d57/structcv_1_1cudev_1_1acos__func_3_01ushort_01_4.html#ace440e4c06446bf686bdf56aaa61e370',1,'cv::cudev::acos_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/da/d97/structcv_1_1cudev_1_1acosh__func.html#a6902cdcdfeff1b7173d4cfffd32d7e03',1,'cv::cudev::acosh_func::operator()()'],['https://docs.opencv.org/4.2.0/d6/de9/structcv_1_1cudev_1_1acosh__func_3_01double_01_4.html#adcdbcc1362f625ca203505bc291a8a3c',1,'cv::cudev::acosh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/de/d89/structcv_1_1cudev_1_1acosh__func_3_01float_01_4.html#a8982e72923a845633808910076483761',1,'cv::cudev::acosh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d52/structcv_1_1cudev_1_1acosh__func_3_01schar_01_4.html#ae815dc363c798f86c639fdbee64d53dc',1,'cv::cudev::acosh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d61/structcv_1_1cudev_1_1acosh__func_3_01short_01_4.html#a7591548bc937a985b6beb8f616ed3eed',1,'cv::cudev::acosh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d17/structcv_1_1cudev_1_1acosh__func_3_01uchar_01_4.html#ab9166b320e5284bbc93311576451082f',1,'cv::cudev::acosh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/de/d8f/structcv_1_1cudev_1_1acosh__func_3_01uint_01_4.html#ae1379c0c1004182761438b8759767f55',1,'cv::cudev::acosh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/db8/structcv_1_1cudev_1_1acosh__func_3_01ushort_01_4.html#aa7121ef1b36d0b4308d6fb954af64194',1,'cv::cudev::acosh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d2a/structcv_1_1cudev_1_1AffineMapPtr.html#a4445dd8e26b3ab12dd94b0a03459f8c7',1,'cv::cudev::AffineMapPtr::operator()()'],['https://docs.opencv.org/4.2.0/d9/dee/structcv_1_1cudev_1_1asin__func.html#ad0dadefec255a3fab08b7b6951976147',1,'cv::cudev::asin_func::operator()()'],['https://docs.opencv.org/4.2.0/d6/d59/structcv_1_1cudev_1_1asin__func_3_01double_01_4.html#ae6b289475377426443000524d7c90085',1,'cv::cudev::asin_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d96/structcv_1_1cudev_1_1asin__func_3_01float_01_4.html#a96523634a121003c18ef94ff4034e750',1,'cv::cudev::asin_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d9/da3/structcv_1_1cudev_1_1asin__func_3_01schar_01_4.html#a0894abd85f1e7283ec0d7987e83870a4',1,'cv::cudev::asin_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d16/structcv_1_1cudev_1_1asin__func_3_01short_01_4.html#ac71145c2171d2ac723c9ea4bc122fd2d',1,'cv::cudev::asin_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/da/d71/structcv_1_1cudev_1_1asin__func_3_01uchar_01_4.html#a6de9805df271a327d045d0423d9b0b7f',1,'cv::cudev::asin_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d65/structcv_1_1cudev_1_1asin__func_3_01uint_01_4.html#a67ae0549ed7d2d8bfcf3f12fbe27f0d9',1,'cv::cudev::asin_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d46/structcv_1_1cudev_1_1asin__func_3_01ushort_01_4.html#ae72849100ba9499ef28b6474b147c639',1,'cv::cudev::asin_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d43/structcv_1_1cudev_1_1asinh__func.html#a3dfa1b292a19d188f40bfe6023044c77',1,'cv::cudev::asinh_func::operator()()'],['https://docs.opencv.org/4.2.0/d7/da8/structcv_1_1cudev_1_1asinh__func_3_01double_01_4.html#ae1635d4b05cded16135c4fdf03708e55',1,'cv::cudev::asinh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d1c/structcv_1_1cudev_1_1asinh__func_3_01float_01_4.html#a854f649e9681f1e6f1c5ae814e53f729',1,'cv::cudev::asinh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/db/db5/structcv_1_1cudev_1_1asinh__func_3_01schar_01_4.html#a6884224d8c6774ded501395c72fbe5c2',1,'cv::cudev::asinh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/df/da7/structcv_1_1cudev_1_1asinh__func_3_01short_01_4.html#aef45a37522498495bf0a4f6ccb55f1cf',1,'cv::cudev::asinh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1cudev_1_1asinh__func_3_01uchar_01_4.html#abe9fca6c5fc501aebd16b35ccdef9dcb',1,'cv::cudev::asinh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d27/structcv_1_1cudev_1_1asinh__func_3_01uint_01_4.html#ae8758ca4e6f926650c902e84e762a2a3',1,'cv::cudev::asinh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dc2/structcv_1_1cudev_1_1asinh__func_3_01ushort_01_4.html#a187311528ee4b3a4be24935b2a0a0c70',1,'cv::cudev::asinh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d8e/structcv_1_1cudev_1_1atan2__func.html#a11d690fd0a2f0d1169808d70e768c7b9',1,'cv::cudev::atan2_func::operator()()'],['https://docs.opencv.org/4.2.0/d8/d15/structcv_1_1cudev_1_1atan2__func_3_01double_01_4.html#ab78ab22ad26665bd7c9832006b3f39b0',1,'cv::cudev::atan2_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d0/df1/structcv_1_1cudev_1_1atan2__func_3_01float_01_4.html#a90ec967495f0b7d8067ca7a8256b0dfe',1,'cv::cudev::atan2_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/da/da9/structcv_1_1cudev_1_1atan2__func_3_01schar_01_4.html#abbf914a1e06e67bbd24d10519212b0b4',1,'cv::cudev::atan2_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d9/dc9/structcv_1_1cudev_1_1atan2__func_3_01short_01_4.html#a2a2a614f5878ff865689740cb2068161',1,'cv::cudev::atan2_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d3/d1d/structcv_1_1cudev_1_1atan2__func_3_01uchar_01_4.html#a13984771ed43545e79b89929980d1e12',1,'cv::cudev::atan2_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d4a/structcv_1_1cudev_1_1atan2__func_3_01uint_01_4.html#a86eb842a0331b8d78aaf9d549f7f9e60',1,'cv::cudev::atan2_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d3/d2f/structcv_1_1cudev_1_1atan2__func_3_01ushort_01_4.html#aac55a6e3c6029d3e78c55621ba4da3b3',1,'cv::cudev::atan2_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/df/d91/structcv_1_1cudev_1_1atan__func.html#aaf59131d17cd6f8e0460b27ab2c3a592',1,'cv::cudev::atan_func::operator()()'],['https://docs.opencv.org/4.2.0/d4/d8e/structcv_1_1cudev_1_1atan__func_3_01double_01_4.html#a7a4e8cda92da1627965c13cf5a7e5bd6',1,'cv::cudev::atan_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dc1/structcv_1_1cudev_1_1atan__func_3_01float_01_4.html#a9dd06696f21326f73219a9676da4cadb',1,'cv::cudev::atan_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d4a/structcv_1_1cudev_1_1atan__func_3_01schar_01_4.html#a2ace3f94c175ba447f5ff3491bbc0f4a',1,'cv::cudev::atan_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d20/structcv_1_1cudev_1_1atan__func_3_01short_01_4.html#a94ca8f0722bdd8644dc260d770717c97',1,'cv::cudev::atan_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/dd/dce/structcv_1_1cudev_1_1atan__func_3_01uchar_01_4.html#afc69d55cb3f353d36edb4a009e6a489b',1,'cv::cudev::atan_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/de6/structcv_1_1cudev_1_1atan__func_3_01uint_01_4.html#a1d4d42bb9b4aa669b985bbbcf2279fd7',1,'cv::cudev::atan_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d1/da0/structcv_1_1cudev_1_1atan__func_3_01ushort_01_4.html#a5ec7b0f0f0ec3e89c8647d985de6a508',1,'cv::cudev::atan_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1cudev_1_1atanh__func.html#a7edb319d3025314f194ed524445ecbb4',1,'cv::cudev::atanh_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/d41/structcv_1_1cudev_1_1atanh__func_3_01double_01_4.html#aa8e199a08e43ec0d5171a69d7338d9d2',1,'cv::cudev::atanh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d2d/structcv_1_1cudev_1_1atanh__func_3_01float_01_4.html#a153da89a9a6d590316ad349f95427817',1,'cv::cudev::atanh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd6/structcv_1_1cudev_1_1atanh__func_3_01schar_01_4.html#acc9242ab80f0ab4475bb28138cc36707',1,'cv::cudev::atanh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1cudev_1_1atanh__func_3_01short_01_4.html#a3bbe7f572ee9bd3a177b840e62d91f7e',1,'cv::cudev::atanh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d90/structcv_1_1cudev_1_1atanh__func_3_01uchar_01_4.html#a1bc8a25394326dca443aafe1dacd79b2',1,'cv::cudev::atanh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/ddc/structcv_1_1cudev_1_1atanh__func_3_01uint_01_4.html#abab90e89b20be773fa2ec8b9c117bdce',1,'cv::cudev::atanh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dd0/structcv_1_1cudev_1_1atanh__func_3_01ushort_01_4.html#a405304579640281e82b10a1b1a7dce8b',1,'cv::cudev::atanh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1detail_1_1BestOf2NearestRangeMatcher.html#a66deb1783f81d32e61e64533aa03e103',1,'cv::detail::BestOf2NearestRangeMatcher::operator()()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#aceb00c1f30edf4b763d510e88a2bd0e1',1,'cv::line_descriptor::BinaryDescriptor::operator()()'],['https://docs.opencv.org/4.2.0/d1/d81/structcv_1_1cudev_1_1BinaryNegate.html#a36756888244e5ef22f86fd4c49fc7a15',1,'cv::cudev::BinaryNegate::operator()()'],['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#ae37dde0385c22b65a264ab65c21f39b9',1,'cv::cudev::BinaryTransformPtr::operator()()'],['https://docs.opencv.org/4.2.0/dc/da3/structcv_1_1cudev_1_1BinaryTupleAdapter.html#a991d05c3c6bdc3cad44d5c06bdb98a51',1,'cv::cudev::BinaryTupleAdapter::operator()()'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1Binder1st.html#a961f08f309d5aee4e0aeaab104903b80',1,'cv::cudev::Binder1st::operator()()'],['https://docs.opencv.org/4.2.0/d6/db4/structcv_1_1cudev_1_1Binder2nd.html#ad0467cfe7ff80497c4d75dfe802bfc6d',1,'cv::cudev::Binder2nd::operator()()'],['https://docs.opencv.org/4.2.0/d9/de7/structcv_1_1cudev_1_1bit__and.html#af7f2f2bbf763662ba9f6ad6d715325b2',1,'cv::cudev::bit_and::operator()()'],['https://docs.opencv.org/4.2.0/d3/d65/structcv_1_1cudev_1_1bit__lshift.html#a319adce84f53f86c628d35bbbf4a6a8f',1,'cv::cudev::bit_lshift::operator()()'],['https://docs.opencv.org/4.2.0/d0/d8a/structcv_1_1cudev_1_1bit__not.html#a54dd18d632ab34ca40cfa34051c6837b',1,'cv::cudev::bit_not::operator()()'],['https://docs.opencv.org/4.2.0/dd/d1c/structcv_1_1cudev_1_1bit__or.html#a9f4238b0c69f7b11dceade45b5e725e7',1,'cv::cudev::bit_or::operator()()'],['https://docs.opencv.org/4.2.0/d4/d2a/structcv_1_1cudev_1_1bit__rshift.html#ab4777501448c008710af761884857af7',1,'cv::cudev::bit_rshift::operator()()'],['https://docs.opencv.org/4.2.0/df/d44/structcv_1_1cudev_1_1bit__xor.html#aae72022cafd71a432dcd395a79ea93c0',1,'cv::cudev::bit_xor::operator()()'],['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#a9d17dbeddaa46c18fa0fa4e4a9e75db3',1,'cv::cudev::BrdBase::operator()()'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#a848eeec7df49f12d767c8460e7d571b4',1,'cv::cudev::BrdConstant::operator()()'],['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html#af6aaa70f1767009aca371d0a195a897f',1,'cv::stereo::CensusKernel::operator()()'],['https://docs.opencv.org/4.2.0/d4/d5b/classcv_1_1stereo_1_1CombinedDescriptor.html#ab5cf7d0c8c4072e3284fc6d140f8675c',1,'cv::stereo::CombinedDescriptor::operator()()'],['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#a59488b025a29244f32bb13b8e88ca9c8',1,'cv::cudev::CommonAreaInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d5/db7/structcv_1_1cudev_1_1ConstantPtr.html#ab9fdee7febaee40d0a8d84dc03e683f6',1,'cv::cudev::ConstantPtr::operator()()'],['https://docs.opencv.org/4.2.0/d6/dfb/structcv_1_1cudev_1_1cos__func.html#a988f8089a8b8d195a2ff3bd00b83d46f',1,'cv::cudev::cos_func::operator()()'],['https://docs.opencv.org/4.2.0/db/d23/structcv_1_1cudev_1_1cos__func_3_01double_01_4.html#aaf9cfdadc2fdf132ce1c6fd1bc4d23c7',1,'cv::cudev::cos_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d7a/structcv_1_1cudev_1_1cos__func_3_01float_01_4.html#aabb752915736cacff3b15eb91a1cc4c5',1,'cv::cudev::cos_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d25/structcv_1_1cudev_1_1cos__func_3_01schar_01_4.html#a1e26eec7e6cf6e3cf0ddfcd4d150f10e',1,'cv::cudev::cos_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d03/structcv_1_1cudev_1_1cos__func_3_01short_01_4.html#a97f88f391e8eccee42251572d6917d39',1,'cv::cudev::cos_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d3d/structcv_1_1cudev_1_1cos__func_3_01uchar_01_4.html#a693d78041e8f0eb86a521d7ea868aaa6',1,'cv::cudev::cos_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/da/dc1/structcv_1_1cudev_1_1cos__func_3_01uint_01_4.html#a2fe66a37f8017659d4528d44361536d8',1,'cv::cudev::cos_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/df/d35/structcv_1_1cudev_1_1cos__func_3_01ushort_01_4.html#ae58914f83f44a50534220d0496c6f134',1,'cv::cudev::cos_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d8a/structcv_1_1cudev_1_1cosh__func.html#a2762fccc8bcb7c73e5029fb2ca79e9b0',1,'cv::cudev::cosh_func::operator()()'],['https://docs.opencv.org/4.2.0/d5/d3a/structcv_1_1cudev_1_1cosh__func_3_01double_01_4.html#a1a46775b2bbfbad92506fb451ee1c79d',1,'cv::cudev::cosh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/db/d8d/structcv_1_1cudev_1_1cosh__func_3_01float_01_4.html#a1ee29ef52dc2cf4be6d5e6270503bea5',1,'cv::cudev::cosh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/df/dd8/structcv_1_1cudev_1_1cosh__func_3_01schar_01_4.html#a7f79b5591445191cb72512e705306d72',1,'cv::cudev::cosh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d8a/structcv_1_1cudev_1_1cosh__func_3_01short_01_4.html#a73e6537c788b836c602d48c0dbf79e38',1,'cv::cudev::cosh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/de/d73/structcv_1_1cudev_1_1cosh__func_3_01uchar_01_4.html#ab4369c5946fe73e32b0eec7f6b77ad75',1,'cv::cudev::cosh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/ddd/structcv_1_1cudev_1_1cosh__func_3_01uint_01_4.html#a43b76700e20129190cc77111c02e53e4',1,'cv::cudev::cosh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd3/structcv_1_1cudev_1_1cosh__func_3_01ushort_01_4.html#a0171124ee451386c0d600734bd840401',1,'cv::cudev::cosh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1CubicInterPtr.html#ab39bee06ee1a2be6a2e38a7d369a716f',1,'cv::cudev::CubicInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#ab5bd6ed0b55f60a2c96b18824f7438dd',1,'cv::CvFeatureEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#aa58bba803ef918036facf78ca50c403c',1,'cv::CvHaarEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga68c6b644dd17b10637cf74117c44e35e',1,'cv::CvHOGEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#a838cd13385f89f2cda2643857d1f34b5',1,'cv::CvLBPEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/d0/d90/structcv_1_1DefaultDeleter_3_01CvCapture_01_4.html#a36b7e1f33f49b098f807f8581b1473a7',1,'cv::DefaultDeleter< CvCapture >::operator()()'],['https://docs.opencv.org/4.2.0/d9/ddf/structcv_1_1DefaultDeleter_3_01CvHaarClassifierCascade_01_4.html#a44656fba99887584e8bc88775dc4888a',1,'cv::DefaultDeleter< CvHaarClassifierCascade >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d37/structcv_1_1DefaultDeleter_3_01CvVideoWriter_01_4.html#a28a310125686255f0149c04ce70ea48e',1,'cv::DefaultDeleter< CvVideoWriter >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#ab006210fdd363a9b0c42f5c11433398d',1,'cv::rgbd::DepthCleaner::operator()()'],['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1cudev_1_1DerivXPtr.html#af9c609af8dbdb0ce6db7e5a9020ec9c0',1,'cv::cudev::DerivXPtr::operator()()'],['https://docs.opencv.org/4.2.0/dc/d51/structcv_1_1cudev_1_1DerivYPtr.html#a1ae2a1e12cc4916fe99f0330eaeb61fd',1,'cv::cudev::DerivYPtr::operator()()'],['https://docs.opencv.org/4.2.0/d3/d97/structcv_1_1cudev_1_1direction__func.html#a2155dbec5fdc65714b561ce94620691a',1,'cv::cudev::direction_func::operator()()'],['https://docs.opencv.org/4.2.0/de/d2a/structcv_1_1cudev_1_1divides.html#a1cd06b89048d107490992a1531fd2a34',1,'cv::cudev::divides::operator()()'],['https://docs.opencv.org/4.2.0/d2/dfd/structcv_1_1cudev_1_1equal__to.html#aa8931c7ed8ea7e2604c38b704b9dfb82',1,'cv::cudev::equal_to::operator()()'],['https://docs.opencv.org/4.2.0/df/d15/classcv_1_1detail_1_1Estimator.html#a0924447fc99df3360b6f005a7c0aa437',1,'cv::detail::Estimator::operator()()'],['https://docs.opencv.org/4.2.0/dc/d8b/structcv_1_1cudev_1_1exp10__func.html#a071ded47294be622de0150f258efd229',1,'cv::cudev::exp10_func::operator()()'],['https://docs.opencv.org/4.2.0/d0/d66/structcv_1_1cudev_1_1exp10__func_3_01double_01_4.html#a626097f0778f1a40babc5517ddb8153a',1,'cv::cudev::exp10_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d78/structcv_1_1cudev_1_1exp10__func_3_01float_01_4.html#afa1c84f89716f836ef03262a078fcdab',1,'cv::cudev::exp10_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dde/structcv_1_1cudev_1_1exp10__func_3_01schar_01_4.html#af0f0403c9cd63a22d8f38071b47485ab',1,'cv::cudev::exp10_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1exp10__func_3_01short_01_4.html#a3ec1f45ae0cdb736f23b16925812d758',1,'cv::cudev::exp10_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d1/ddd/structcv_1_1cudev_1_1exp10__func_3_01uchar_01_4.html#aaccfbfbcf2c5636b4ebcffb40b744427',1,'cv::cudev::exp10_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/dc3/structcv_1_1cudev_1_1exp10__func_3_01uint_01_4.html#aef6b50b90e3757e58b6cd47fd83eaeff',1,'cv::cudev::exp10_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d4/da4/structcv_1_1cudev_1_1exp10__func_3_01ushort_01_4.html#a2432a747a7d34541301142a46460a7e2',1,'cv::cudev::exp10_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/dd9/structcv_1_1cudev_1_1exp2__func.html#a7a72f8aa55099dd88aa51a6e2bf51730',1,'cv::cudev::exp2_func::operator()()'],['https://docs.opencv.org/4.2.0/d8/d9b/structcv_1_1cudev_1_1exp2__func_3_01double_01_4.html#aa8b8ebaa15b369605febaf2943a48534',1,'cv::cudev::exp2_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dc7/structcv_1_1cudev_1_1exp2__func_3_01float_01_4.html#a76a28168041a40040a59dbe5fcf80ede',1,'cv::cudev::exp2_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/de/da5/structcv_1_1cudev_1_1exp2__func_3_01schar_01_4.html#ab6cd4172be5a97a114e658ee7d8e8d94',1,'cv::cudev::exp2_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/da/d29/structcv_1_1cudev_1_1exp2__func_3_01short_01_4.html#a802f2e62fad66e331f08ed2d50ae420f',1,'cv::cudev::exp2_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d8b/structcv_1_1cudev_1_1exp2__func_3_01uchar_01_4.html#ad1357ddfd7831d00bf1716a740a10b7e',1,'cv::cudev::exp2_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/dc/dd4/structcv_1_1cudev_1_1exp2__func_3_01uint_01_4.html#afba60094be1fee3c426c31fe0c028aea',1,'cv::cudev::exp2_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d30/structcv_1_1cudev_1_1exp2__func_3_01ushort_01_4.html#acd9f9bdf9f2f21c3e4ddda350e62026c',1,'cv::cudev::exp2_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d73/structcv_1_1cudev_1_1exp__func.html#ab52d8176579e6d655d820a20360dc305',1,'cv::cudev::exp_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/db1/structcv_1_1cudev_1_1exp__func_3_01double_01_4.html#ad391b31dd35af417fe08dc8761676b1d',1,'cv::cudev::exp_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/df/dba/structcv_1_1cudev_1_1exp__func_3_01float_01_4.html#adc085ebcc030437fec9cc33766e62b45',1,'cv::cudev::exp_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d33/structcv_1_1cudev_1_1exp__func_3_01schar_01_4.html#ad3a33474b50895c9ea0de63bcc01bd31',1,'cv::cudev::exp_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d67/structcv_1_1cudev_1_1exp__func_3_01short_01_4.html#a537df0eeb7a971b7196baf6b1fbe8b46',1,'cv::cudev::exp_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d9/de4/structcv_1_1cudev_1_1exp__func_3_01uchar_01_4.html#aba3778efd452fe016b2551ae25a9e0bd',1,'cv::cudev::exp_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1exp__func_3_01uint_01_4.html#ab1ca81dfae2fa4613035d53d71337b2e',1,'cv::cudev::exp_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dde/structcv_1_1cudev_1_1exp__func_3_01ushort_01_4.html#a07d2ad1cb4b3aa588eb4ffc44a18cef8',1,'cv::cudev::exp_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/df/db2/classcv_1_1cuda_1_1FastOpticalFlowBM.html#ac149a65983f02fa91a5a7a53eb232cf2',1,'cv::cuda::FastOpticalFlowBM::operator()()'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a5d5793f2f71bae1cb72acc3e95d069df',1,'cv::detail::FeaturesMatcher::operator()(const ImageFeatures &features1, const ImageFeatures &features2, MatchesInfo &matches_info)'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a2df19558a646700d9543841cafae4bc2',1,'cv::detail::FeaturesMatcher::operator()(const std::vector< ImageFeatures > &features, std::vector< MatchesInfo > &pairwise_matches, const cv::UMat &mask=cv::UMat())'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ad2ed48a66be94fae14bc3a2a08ea8e95',1,'cv::GCompiled::operator()(GRunArgs &&ins, GRunArgsP &&outs)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a8ada1c617461a8b366b997be5c438d4a',1,'cv::GCompiled::operator()(cv::Mat in, cv::Mat &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a68bcf146b1479be128ee4bb39035fc43',1,'cv::GCompiled::operator()(cv::Mat in, cv::Scalar &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a7878a8cf7a6e5f5542777c8e1b5c977a',1,'cv::GCompiled::operator()(cv::Mat in1, cv::Mat in2, cv::Mat &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ac7ea0e242325db157f9dc95cf2c47845',1,'cv::GCompiled::operator()(cv::Mat in1, cv::Mat in2, cv::Scalar &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#aa4751e20cd8fa27947b073366d3c130c',1,'cv::GCompiled::operator()(const std::vector< cv::Mat > &ins, const std::vector< cv::Mat > &outs)'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#a8a2d9c2741c247165e1778a35eeedec7',1,'cv::cudev::GlobPtr::operator()(int y, int x)'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#a630b28b0982df38fa4a8370df54c8876',1,'cv::cudev::GlobPtr::operator()(int y, int x) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a2b3c25e36b0f82ca8f9f74b6ae68c41d',1,'cv::cuda::GpuMat::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a217e27e7051bed168c34ba767915cc63',1,'cv::cuda::GpuMat::operator()(Rect roi) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#aa1ccd7742a80a4f084c78f1d61601073',1,'cv::cudev::GpuMat_::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a5770b11d962d14d542b915f81441ccb4',1,'cv::cudev::GpuMat_::operator()(Rect roi) const'],['https://docs.opencv.org/4.2.0/d9/d1c/structcv_1_1cudev_1_1greater.html#a094203d3b37c3c215eac4c0250577dd3',1,'cv::cudev::greater::operator()()'],['https://docs.opencv.org/4.2.0/dd/d08/structcv_1_1cudev_1_1greater__equal.html#af19f72ea85d3d1fbff57c2cbe0cbb05e',1,'cv::cudev::greater_equal::operator()()'],['https://docs.opencv.org/4.2.0/d3/d59/structcv_1_1Hamming.html#a3d6ec47bfdc0d89f191428ccbfe00823',1,'cv::Hamming::operator()()'],['https://docs.opencv.org/4.2.0/d3/d10/structstd_1_1hash_3_01cv_1_1gapi_1_1GBackend_01_4.html#a5064b9ea589368a0f1814598cfcb67c8',1,'std::hash< cv::gapi::GBackend >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d99/structstd_1_1hash_3_01cv_1_1GShape_01_4.html#aabcf77cfe57beafe3afffb118967829a',1,'std::hash< cv::GShape >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d3e/structcv_1_1cudev_1_1hypot__func.html#a2f42ede8772f0144017fbfc07486947d',1,'cv::cudev::hypot_func::operator()()'],['https://docs.opencv.org/4.2.0/d6/d05/structcv_1_1cudev_1_1hypot__func_3_01double_01_4.html#ac8bf27e184911fc704e88916c649111c',1,'cv::cudev::hypot_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d37/structcv_1_1cudev_1_1hypot__func_3_01float_01_4.html#a66cf4ee063a301dc96ee60077be2294f',1,'cv::cudev::hypot_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/df/dbd/structcv_1_1cudev_1_1hypot__func_3_01schar_01_4.html#aaf99e66892b49d09d373efd1f40fa989',1,'cv::cudev::hypot_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d0b/structcv_1_1cudev_1_1hypot__func_3_01short_01_4.html#a09105d3f2332f484875c304fba5bcc0e',1,'cv::cudev::hypot_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/db0/structcv_1_1cudev_1_1hypot__func_3_01uchar_01_4.html#aa16959b94a6a1da0516f20fefa457cca',1,'cv::cudev::hypot_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dad/structcv_1_1cudev_1_1hypot__func_3_01uint_01_4.html#a6f4a739bd0d21bd64e163cfb091fc3e2',1,'cv::cudev::hypot_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d26/structcv_1_1cudev_1_1hypot__func_3_01ushort_01_4.html#a32ad689516093e2d048d47e1775e71bf',1,'cv::cudev::hypot_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/df/d22/structcv_1_1cudev_1_1identity.html#ae8e53f80a081edd0156421f7e502674a',1,'cv::cudev::identity::operator()()'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#ab439f549a54e7fb4d077d51e26fc1e81',1,'cv::cudev::IntegerAreaInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1L1.html#a6e1989c64affb81cd157f49f9b8b93b0',1,'cv::L1::operator()()'],['https://docs.opencv.org/4.2.0/dc/daa/structcv_1_1L2.html#a1bd9f1b3a846126410d188c72645c25d',1,'cv::L2::operator()()'],['https://docs.opencv.org/4.2.0/d0/de6/structcv_1_1cudev_1_1LaplacianPtr_3_011_00_01SrcPtr_01_4.html#a378fe7b55d2ee57979706e7cbd3a3dde',1,'cv::cudev::LaplacianPtr< 1, SrcPtr >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d89/structcv_1_1cudev_1_1LaplacianPtr_3_013_00_01SrcPtr_01_4.html#af02fec60f0690261a54910e6e1ca5542',1,'cv::cudev::LaplacianPtr< 3, SrcPtr >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d04/structcv_1_1cudev_1_1less.html#aef70d1d8dee6dca98128735c2a60f486',1,'cv::cudev::less::operator()()'],['https://docs.opencv.org/4.2.0/d1/d03/structcv_1_1cudev_1_1less__equal.html#a35cab8e57e6e215821e61ed7d116045e',1,'cv::cudev::less_equal::operator()()'],['https://docs.opencv.org/4.2.0/d7/d8a/structcv_1_1cudev_1_1LinearInterPtr.html#a354dbbfbda853a6497da10ac614732ea',1,'cv::cudev::LinearInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d8/da8/structcv_1_1cudev_1_1log10__func.html#a8ed0d87633e88b1e5ec26ccb62017a84',1,'cv::cudev::log10_func::operator()()'],['https://docs.opencv.org/4.2.0/dc/d32/structcv_1_1cudev_1_1log10__func_3_01double_01_4.html#a55aa0560ae5a0fc01487540ff1658e87',1,'cv::cudev::log10_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d42/structcv_1_1cudev_1_1log10__func_3_01float_01_4.html#ae7011f3b9f7529c765c6d4433e93d9bc',1,'cv::cudev::log10_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d4b/structcv_1_1cudev_1_1log10__func_3_01schar_01_4.html#ab04065a7b741671ea7050e5367a94362',1,'cv::cudev::log10_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d00/structcv_1_1cudev_1_1log10__func_3_01short_01_4.html#a4490ba24cdd88c8c1708830583aef024',1,'cv::cudev::log10_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/dd/dcc/structcv_1_1cudev_1_1log10__func_3_01uchar_01_4.html#a4f9937403d93a32fe7d0e9b18831821c',1,'cv::cudev::log10_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/df/d6e/structcv_1_1cudev_1_1log10__func_3_01uint_01_4.html#af462996a0b52e703042273d4533983b7',1,'cv::cudev::log10_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d0/df1/structcv_1_1cudev_1_1log10__func_3_01ushort_01_4.html#aef130449d3276fedd53036bbaafe6828',1,'cv::cudev::log10_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1cudev_1_1log2__func.html#aba0f8b5ead7e4fb3e6f8c6f2cbcddca9',1,'cv::cudev::log2_func::operator()()'],['https://docs.opencv.org/4.2.0/dc/d17/structcv_1_1cudev_1_1log2__func_3_01double_01_4.html#ae825f360d7a8c1c2976ec16a52afcbe3',1,'cv::cudev::log2_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/db/dba/structcv_1_1cudev_1_1log2__func_3_01float_01_4.html#afdfb43df5d0d168e65bfa795f0654034',1,'cv::cudev::log2_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1log2__func_3_01schar_01_4.html#aeb64ee83eecff169547ebf72ff37f2f4',1,'cv::cudev::log2_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d0b/structcv_1_1cudev_1_1log2__func_3_01short_01_4.html#a7dc4e28152086625533614481d4c436f',1,'cv::cudev::log2_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d41/structcv_1_1cudev_1_1log2__func_3_01uchar_01_4.html#a169dfefed3bcccacbf67bdb20f119f5e',1,'cv::cudev::log2_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/df/d69/structcv_1_1cudev_1_1log2__func_3_01uint_01_4.html#ae44865085e382670f17536552d9f8d1a',1,'cv::cudev::log2_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d0/dda/structcv_1_1cudev_1_1log2__func_3_01ushort_01_4.html#afe1f535584f0fcaa41dd4aac88871bd9',1,'cv::cudev::log2_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d41/structcv_1_1cudev_1_1log__func.html#a943bb3c0839bc97fc724689bb0fe8651',1,'cv::cudev::log_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/dad/structcv_1_1cudev_1_1log__func_3_01double_01_4.html#ad41e4d4a49cba0a2f14ce7b44860f102',1,'cv::cudev::log_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d85/structcv_1_1cudev_1_1log__func_3_01float_01_4.html#ad9d324de3522e32adda4eed82c24669b',1,'cv::cudev::log_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d2/de1/structcv_1_1cudev_1_1log__func_3_01schar_01_4.html#a299f70fa2dc5d67e51165035904d9eb8',1,'cv::cudev::log_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d19/structcv_1_1cudev_1_1log__func_3_01short_01_4.html#a77a4daf23da2dd3f99aa6559106101b4',1,'cv::cudev::log_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d3/db5/structcv_1_1cudev_1_1log__func_3_01uchar_01_4.html#a877322f5cbcc6845276f7096a39a59d2',1,'cv::cudev::log_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d0/dee/structcv_1_1cudev_1_1log__func_3_01uint_01_4.html#a6d1fe6935269490408f023d6dbc82d80',1,'cv::cudev::log_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d0c/structcv_1_1cudev_1_1log__func_3_01ushort_01_4.html#a25d4a879c093d9c65d9ae24021a599c9',1,'cv::cudev::log_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1cudev_1_1logical__and.html#a6a80f03acb116ed9e5f3f533dd8cf1a6',1,'cv::cudev::logical_and::operator()()'],['https://docs.opencv.org/4.2.0/d4/d01/structcv_1_1cudev_1_1logical__not.html#a5d6fd2eb21769c8ab859395f9aaad133',1,'cv::cudev::logical_not::operator()()'],['https://docs.opencv.org/4.2.0/d3/db2/structcv_1_1cudev_1_1logical__or.html#a682a316f3d1c904a8b03f4132a432955',1,'cv::cudev::logical_or::operator()()'],['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html#a45ddaa9b235af7db44bb4cee9fc02a04',1,'cv::cudev::LutPtr::operator()()'],['https://docs.opencv.org/4.2.0/d1/deb/structcv_1_1cudev_1_1magnitude__func.html#a89c8b5fbcd6dfe676ac11e6e4b339287',1,'cv::cudev::magnitude_func::operator()()'],['https://docs.opencv.org/4.2.0/d3/da4/structcv_1_1cudev_1_1magnitude__sqr__func.html#aaaab7e87a8f39b310caf6f0e20a623c3',1,'cv::cudev::magnitude_sqr_func::operator()()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ad543b6bd296ae1247032c750af4718e1',1,'cv::Mat::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a4272fce43d7405603fbb5e5f52580e57',1,'cv::Mat::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aee56475f834069b1fad3877c0747aaeb',1,'cv::Mat::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa9bf4fcbb6e854a6db7b7254a205fac9',1,'cv::Mat::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#aafddf1814d6868d7c67220cf5726f932',1,'cv::gapi::own::Mat::operator()()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'cv::Mat_::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'cv::Mat_::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'cv::Mat_::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'cv::Mat_::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'cv::Mat_::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'cv::Mat_::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'cv::Mat_::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'cv::Mat_::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'cv::Mat_::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'cv::Mat_::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'cv::Mat_::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'cv::Mat_::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'cv::Mat_::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'cv::Mat_::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'cv::Mat_::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'cv::Mat_::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< double >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< double >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< double >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< double >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< double >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< double >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< double >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< double >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< double >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< double >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< double >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< double >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< double >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< double >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< double >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< double >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< float >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< float >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< float >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< float >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< float >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< float >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< float >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< float >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< float >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< float >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< float >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< float >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< float >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< float >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< float >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< float >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< uchar >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< uchar >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< uchar >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< uchar >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< uchar >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< uchar >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< uchar >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< uchar >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< uchar >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< uchar >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< uchar >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< uchar >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< uchar >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< uchar >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< uchar >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< uchar >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< unsigned char >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< unsigned char >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< unsigned char >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< unsigned char >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< unsigned char >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< unsigned char >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< unsigned char >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< unsigned char >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< unsigned char >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< unsigned char >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< unsigned char >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< unsigned char >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< unsigned char >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< unsigned char >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< unsigned char >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< unsigned char >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6bceaa05f2fea4c73bc95f4b9e7d09bf',1,'cv::MatExpr::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae3d4aa0cf6b40c5829c6377a54101068',1,'cv::MatExpr::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#abdc35c3d1d636243a9fa4b7e3a4810fe',1,'cv::MatSize::operator()()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'cv::Matx::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'cv::Matx::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'cv::Matx::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'cv::Matx::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< _Tp, cn, 1 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< _Tp, cn, 1 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< _Tp, cn, 1 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< _Tp, cn, 1 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 1, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 1, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 1, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 1, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 2, 2 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 2, 2 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 2, 2 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 2, 2 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 2, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 2, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 2, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 2, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 3, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 3, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 3, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 3, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 3, 4 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 3, 4 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 3, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 3, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 4, 4 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 4, 4 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 4, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 4, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, cn, 1 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, cn, 1 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, cn, 1 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, cn, 1 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float, 2, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float, 2, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float, 2, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float, 2, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float, 3, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float, 3, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float, 3, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float, 3, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float, cn, 1 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float, cn, 1 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float, cn, 1 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float, cn, 1 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float_type, 4, 4 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float_type, 4, 4 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float_type, 4, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float_type, 4, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d4/d31/structcv_1_1cudev_1_1maximum.html#a23944a3a9a900d9121217a9b2bd7cf1e',1,'cv::cudev::maximum::operator()()'],['https://docs.opencv.org/4.2.0/dc/d65/structcv_1_1cudev_1_1maximum_3_01double_01_4.html#aaa3ea51b43edde4613cd12bfdcb9d760',1,'cv::cudev::maximum< double >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d1e/structcv_1_1cudev_1_1maximum_3_01float_01_4.html#a38c973c79baab206514a0b3108633add',1,'cv::cudev::maximum< float >::operator()()'],['https://docs.opencv.org/4.2.0/df/df2/structcv_1_1cudev_1_1maximum_3_01schar_01_4.html#a5ec2a8da9db4e38703a428def99c26d2',1,'cv::cudev::maximum< schar >::operator()()'],['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1maximum_3_01short_01_4.html#a9d79fb3032785722e26b00a37995a045',1,'cv::cudev::maximum< short >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d84/structcv_1_1cudev_1_1maximum_3_01uchar_01_4.html#a98a3d896491e04c7d9977eed91f2362f',1,'cv::cudev::maximum< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dfa/structcv_1_1cudev_1_1maximum_3_01uint_01_4.html#a6f78b59b8fde2766a8827de3f01d8db8',1,'cv::cudev::maximum< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d0/dac/structcv_1_1cudev_1_1maximum_3_01ushort_01_4.html#a5bda4bdb72d47bcb77ff15390922e450',1,'cv::cudev::maximum< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a8c678dd239c97b2fd12611f1363900f0',1,'cv::stereo::MCTKernel::operator()()'],['https://docs.opencv.org/4.2.0/de/d9b/classcv_1_1stereo_1_1MeanKernelIntegralImage.html#a806da8fa9a91098398f78c36d79e3991',1,'cv::stereo::MeanKernelIntegralImage::operator()()'],['https://docs.opencv.org/4.2.0/d5/dc9/structcv_1_1cudev_1_1minimum.html#acdf2ef08e5d48af75d2122e8671aea68',1,'cv::cudev::minimum::operator()()'],['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1minimum_3_01double_01_4.html#a48a0b885006be6a0fa8e9d11c54d4e5b',1,'cv::cudev::minimum< double >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d9d/structcv_1_1cudev_1_1minimum_3_01float_01_4.html#a8fbc1f931bb9d8d68e623e7bc561382a',1,'cv::cudev::minimum< float >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d75/structcv_1_1cudev_1_1minimum_3_01schar_01_4.html#a8f420b811fad523efc6aa53007d6d966',1,'cv::cudev::minimum< schar >::operator()()'],['https://docs.opencv.org/4.2.0/db/d5b/structcv_1_1cudev_1_1minimum_3_01short_01_4.html#af73ef8474d4331959f890e839e0c6253',1,'cv::cudev::minimum< short >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d48/structcv_1_1cudev_1_1minimum_3_01uchar_01_4.html#a7deb2150864ae4502dc4441bc12d4336',1,'cv::cudev::minimum< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1cudev_1_1minimum_3_01uint_01_4.html#adf25e14f21fe7eb1537a294d819d79d1',1,'cv::cudev::minimum< uint >::operator()()'],['https://docs.opencv.org/4.2.0/de/dfa/structcv_1_1cudev_1_1minimum_3_01ushort_01_4.html#ac33cd62d0c0ebbeed517eab9d577517d',1,'cv::cudev::minimum< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/da/df1/structcv_1_1cudev_1_1minus.html#aa2c21f87c2bc60ae0d5c5d7770b023c8',1,'cv::cudev::minus::operator()()'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#a33ef2dffc9591c30f8fee5f6b5ae7e04',1,'cv::stereo::ModifiedCsCensus::operator()()'],['https://docs.opencv.org/4.2.0/d7/d7f/structcv_1_1cudev_1_1modulus.html#adbb9a4b035592f32258f013f378d50dd',1,'cv::cudev::modulus::operator()()'],['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1cudev_1_1multiplies.html#ae098f5637977e29132fbb3a8607921a9',1,'cv::cudev::multiplies::operator()()'],['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#a2e082e01e62b186decf5a1f58884dd80',1,'cv::stereo::MVKernel::operator()()'],['https://docs.opencv.org/4.2.0/d0/df5/structcv_1_1cudev_1_1NearestInterPtr.html#afa902e3d702382f0a68112d8342b24f3',1,'cv::cudev::NearestInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1negate.html#a9729e5847cd4d6004ac225e156cdbe86',1,'cv::cudev::negate::operator()()'],['https://docs.opencv.org/4.2.0/df/d9f/structcv_1_1cudev_1_1not__equal__to.html#ac80d0c172252fb5bc65ed4671113ea23',1,'cv::cudev::not_equal_to::operator()()'],['https://docs.opencv.org/4.2.0/d2/d74/classcv_1_1ParallelLoopBody.html#a90285bcea9c56345622bfd6817d41b1f',1,'cv::ParallelLoopBody::operator()()'],['https://docs.opencv.org/4.2.0/d3/d78/classcv_1_1ParallelLoopBodyLambdaWrapper.html#a6b7b341ff554b63cda3e71f4481a38d7',1,'cv::ParallelLoopBodyLambdaWrapper::operator()()'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a26e76331a68988144a403649c6b8af5c',1,'cv::PCA::operator()(InputArray data, InputArray mean, int flags, int maxComponents=0)'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#aff68797b34e6edb162b0f5d1819b2e9f',1,'cv::PCA::operator()(InputArray data, InputArray mean, int flags, double retainedVariance)'],['https://docs.opencv.org/4.2.0/df/d20/structcv_1_1cudev_1_1PerspectiveMapPtr.html#aa9a16f8b9d196cbac5122f2bea12fada',1,'cv::cudev::PerspectiveMapPtr::operator()()'],['https://docs.opencv.org/4.2.0/d4/dd0/structcv_1_1cudev_1_1plus.html#a149c533def9926ab9d6e6ca57257068a',1,'cv::cudev::plus::operator()()'],['https://docs.opencv.org/4.2.0/da/dda/structcv_1_1cudev_1_1pow__func.html#a4fe691da815bb8f351f6816e4ad7311a',1,'cv::cudev::pow_func::operator()()'],['https://docs.opencv.org/4.2.0/d2/deb/structcv_1_1cudev_1_1pow__func_3_01double_01_4.html#ac79d0918dd34db9fb7703a573ae3e83c',1,'cv::cudev::pow_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d3/dea/structcv_1_1cudev_1_1project1st.html#ab10af9ecf413990340288b5d49d8314e',1,'cv::cudev::project1st::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd5/structcv_1_1cudev_1_1project2nd.html#a33823b1e54a8d5b4085163083b7a460d',1,'cv::cudev::project2nd::operator()()'],['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html#a83f91a025a0f41d3a0b528478a3cb532',1,'cv::cudev::RemapPtr1::operator()()'],['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#ab539f18b7ebc19adf055670324c2bc09',1,'cv::cudev::RemapPtr2::operator()()'],['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#aa890dd8d7b5108f77108b0f3dbf2d87f',1,'cv::cudev::ResizePtr::operator()()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a48c33f26d8662a1b3becfda60292ac5c',1,'cv::rgbd::RgbdNormals::operator()()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a1a638d0a9367b86bc56b98b9e550b9dc',1,'cv::rgbd::RgbdPlane::operator()(InputArray points3d, InputArray normals, OutputArray mask, OutputArray plane_coefficients)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a8c519cbffd2b296330b1ef5081530968',1,'cv::rgbd::RgbdPlane::operator()(InputArray points3d, OutputArray mask, OutputArray plane_coefficients)'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a16ca31c8e2ec0990df323b442ab09e4f',1,'cv::RNG::operator()()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#ac0112dc300696b1fc7998d37f15dd733',1,'cv::RNG::operator()(unsigned N)'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a5102b5f43fc7c2997f2d2bc6b693e0b4',1,'cv::RNG_MT19937::operator()(unsigned N)'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#aa52601c233cda79131052299a88ad9c2',1,'cv::RNG_MT19937::operator()()'],['https://docs.opencv.org/4.2.0/d3/d11/structcv_1_1cudev_1_1saturate__cast__fp16__func_3_01float_00_01short_01_4.html#a535ca2a5e7cf42d0da2d17fed04daf16',1,'cv::cudev::saturate_cast_fp16_func< float, short >::operator()()'],['https://docs.opencv.org/4.2.0/dc/dc5/structcv_1_1cudev_1_1saturate__cast__fp16__func_3_01short_00_01float_01_4.html#aadd03bfafa293e9fd11986416a8df232',1,'cv::cudev::saturate_cast_fp16_func< short, float >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d99/structcv_1_1cudev_1_1saturate__cast__func.html#addfef20cf8679f6924202369963bd203',1,'cv::cudev::saturate_cast_func::operator()()'],['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1ScharrXPtr.html#ad7c3ca0e1936de91a4da451b12e05461',1,'cv::cudev::ScharrXPtr::operator()()'],['https://docs.opencv.org/4.2.0/d0/d70/structcv_1_1cudev_1_1ScharrYPtr.html#a0d7970b76e5d9f21a0681ca5d794e703',1,'cv::cudev::ScharrYPtr::operator()()'],['https://docs.opencv.org/4.2.0/d1/d65/classcv_1_1SimilarRects.html#a7e70f1c43c4bf8c75851211fb50b265a',1,'cv::SimilarRects::operator()()'],['https://docs.opencv.org/4.2.0/d1/d05/structcv_1_1cudev_1_1sin__func.html#a81bbace4665b94419c862d3dcccdc280',1,'cv::cudev::sin_func::operator()()'],['https://docs.opencv.org/4.2.0/d8/d1c/structcv_1_1cudev_1_1sin__func_3_01double_01_4.html#a8b60b51b51637af0504911dc4d98e2b9',1,'cv::cudev::sin_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d2b/structcv_1_1cudev_1_1sin__func_3_01float_01_4.html#af6ea0d2d4b951bffc9a716a2265c29c9',1,'cv::cudev::sin_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d1b/structcv_1_1cudev_1_1sin__func_3_01schar_01_4.html#a78e9a2b21c9467947f65a9d27036c39f',1,'cv::cudev::sin_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d6f/structcv_1_1cudev_1_1sin__func_3_01short_01_4.html#a8c9bfa6683708b41101edd0290af9fcd',1,'cv::cudev::sin_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dfd/structcv_1_1cudev_1_1sin__func_3_01uchar_01_4.html#a73cc54b71202279bf8805e0c7f0ab847',1,'cv::cudev::sin_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/dbd/structcv_1_1cudev_1_1sin__func_3_01uint_01_4.html#a4511fade1bcfc1f7545c8c8c8c4f3b97',1,'cv::cudev::sin_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d22/structcv_1_1cudev_1_1sin__func_3_01ushort_01_4.html#a0a9f7a66d2a283b05e08ac48947d77f7',1,'cv::cudev::sin_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#a35f754723c723f5ac9ae9c6ae5ddf27d',1,'cv::cudev::SingleMaskChannels::operator()()'],['https://docs.opencv.org/4.2.0/d8/da0/structcv_1_1cudev_1_1sinh__func.html#aa12abb185d04fd4e0df2c97af973366b',1,'cv::cudev::sinh_func::operator()()'],['https://docs.opencv.org/4.2.0/db/dde/structcv_1_1cudev_1_1sinh__func_3_01double_01_4.html#ae0418acd67e1ea0a541a315623bf14fa',1,'cv::cudev::sinh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d3/df1/structcv_1_1cudev_1_1sinh__func_3_01float_01_4.html#a064843f9badf0ed3155b4231bf2ca95c',1,'cv::cudev::sinh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/de/df6/structcv_1_1cudev_1_1sinh__func_3_01schar_01_4.html#a6f95259b1094b0b7bbc5bdb47cafbfad',1,'cv::cudev::sinh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/da/d3e/structcv_1_1cudev_1_1sinh__func_3_01short_01_4.html#a01703492193b054aece7b2d8f2b11357',1,'cv::cudev::sinh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d4/dd2/structcv_1_1cudev_1_1sinh__func_3_01uchar_01_4.html#ae09891519bc4df762a12bedbcc1e41c3',1,'cv::cudev::sinh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/de/d13/structcv_1_1cudev_1_1sinh__func_3_01uint_01_4.html#a0f28cf3217ef7ae5e6be21ee888a0d2d',1,'cv::cudev::sinh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d38/structcv_1_1cudev_1_1sinh__func_3_01ushort_01_4.html#a6667d95cc7c1a83c4c9518a7848ab83d',1,'cv::cudev::sinh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html#a7a6c92810b7489377eb91727182b0e60',1,'cv::SL2::operator()()'],['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1SobelXPtr.html#a50ddaa92c615685b26263653013fffc4',1,'cv::cudev::SobelXPtr::operator()()'],['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1SobelYPtr.html#a96976834e33e5c4735361a8c62b7e68f',1,'cv::cudev::SobelYPtr::operator()()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ad7c0f0164b060df2179b3e9f1d1566a8',1,'cv::SparseMat_::operator()(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a89b99bb281a9747b54e94be670f6a010',1,'cv::SparseMat_::operator()(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ab4ffea87933a1bffcadd0db260c36846',1,'cv::SparseMat_::operator()(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ae68f3e59954cc03297b2d0e6e8ba9014',1,'cv::SparseMat_::operator()(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d9/d1d/structcv_1_1cudev_1_1sqr__func.html#a653443fdeefc72965e7ff269f28bb9dc',1,'cv::cudev::sqr_func::operator()()'],['https://docs.opencv.org/4.2.0/d9/d47/structcv_1_1cudev_1_1sqrt__func.html#a3c13827c0c81360668c03101aec9f447',1,'cv::cudev::sqrt_func::operator()()'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1cudev_1_1sqrt__func_3_01double_01_4.html#a0ed5e0351bd2e8fc4012c231307269b4',1,'cv::cudev::sqrt_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dd2/structcv_1_1cudev_1_1sqrt__func_3_01float_01_4.html#a03e90b3bb7445759653b84ccd259a22d',1,'cv::cudev::sqrt_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/da/d64/structcv_1_1cudev_1_1sqrt__func_3_01schar_01_4.html#aa4afd2cf29659cfb2e992b78aa383038',1,'cv::cudev::sqrt_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d6a/structcv_1_1cudev_1_1sqrt__func_3_01short_01_4.html#a0f6eeddb105a2097a452b52c1dfc384b',1,'cv::cudev::sqrt_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d33/structcv_1_1cudev_1_1sqrt__func_3_01uchar_01_4.html#a3196e3954b0e70277deba6b6ded42ec7',1,'cv::cudev::sqrt_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d7b/structcv_1_1cudev_1_1sqrt__func_3_01uint_01_4.html#a42e59fdead1f2063b1b06e89b3d915e9',1,'cv::cudev::sqrt_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/df/df4/structcv_1_1cudev_1_1sqrt__func_3_01ushort_01_4.html#adac64ea929bfe2d165affcbf44a767df',1,'cv::cudev::sqrt_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1stereo_1_1StarKernelCensus.html#a3d6e4998cc5b42e0fce4cc490251de9e',1,'cv::stereo::StarKernelCensus::operator()()'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a67ee54d1221b03d9866393effaeeb8dd',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, GpuMat &keypoints)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#aa0ed78380fe2142a729e424aa195263c',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, GpuMat &keypoints, GpuMat &descriptors, bool useProvidedKeypoints=false)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a9bb91e3bffd09e0e65c91c45da669304',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, std::vector< KeyPoint > &keypoints)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#aec817660a3ecbb64f0afa54354a8af5c',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, std::vector< KeyPoint > &keypoints, GpuMat &descriptors, bool useProvidedKeypoints=false)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#ad254c526ba8d61e66a40ebabf5a6c847',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, std::vector< KeyPoint > &keypoints, std::vector< float > &descriptors, bool useProvidedKeypoints=false)'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#ad9ade269f8234b171413e4ff639a3128',1,'cv::SVD::operator()()'],['https://docs.opencv.org/4.2.0/dd/d24/classcv_1_1stereo_1_1SymetricCensus.html#a8b4e095d57a6cc44fd4997af55f2d34b',1,'cv::stereo::SymetricCensus::operator()()'],['https://docs.opencv.org/4.2.0/d7/d3e/structcv_1_1cudev_1_1tan__func.html#a2482523afd1e226cf46eca69ab6ded31',1,'cv::cudev::tan_func::operator()()'],['https://docs.opencv.org/4.2.0/db/dc4/structcv_1_1cudev_1_1tan__func_3_01double_01_4.html#abe568bfe0f6458d5f94824e3c8133869',1,'cv::cudev::tan_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d4e/structcv_1_1cudev_1_1tan__func_3_01float_01_4.html#ac7092cea3ad156fa30ff5a7aeefb1dfa',1,'cv::cudev::tan_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d9d/structcv_1_1cudev_1_1tan__func_3_01schar_01_4.html#a5d739a35f50c97b273f822c325204d24',1,'cv::cudev::tan_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dbd/structcv_1_1cudev_1_1tan__func_3_01short_01_4.html#a57af0b55d41554ecea3a1bf5ef4c7653',1,'cv::cudev::tan_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d0d/structcv_1_1cudev_1_1tan__func_3_01uchar_01_4.html#a03d6d6b2c000bd957bfa4df61f8a744f',1,'cv::cudev::tan_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d9e/structcv_1_1cudev_1_1tan__func_3_01uint_01_4.html#a6bf5488503341bbacb61b959103c7702',1,'cv::cudev::tan_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d63/structcv_1_1cudev_1_1tan__func_3_01ushort_01_4.html#a4ad3366dca634dbe0edb6b8e8e4a3739',1,'cv::cudev::tan_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1tanh__func.html#acdf93453f1d2131aecd26c37d3cfc79d',1,'cv::cudev::tanh_func::operator()()'],['https://docs.opencv.org/4.2.0/d4/d9f/structcv_1_1cudev_1_1tanh__func_3_01double_01_4.html#a58e54574cb02f13e2129204c349a8f9c',1,'cv::cudev::tanh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/dc/da0/structcv_1_1cudev_1_1tanh__func_3_01float_01_4.html#a7e21f8cf9b8d4cc3fa043fc80c3ea11c',1,'cv::cudev::tanh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d5/dfc/structcv_1_1cudev_1_1tanh__func_3_01schar_01_4.html#ab297810c17a3e1b9c39b32d71c2b6f9f',1,'cv::cudev::tanh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d8/db4/structcv_1_1cudev_1_1tanh__func_3_01short_01_4.html#a66d82124b6cfae4ab90e027781b3e366',1,'cv::cudev::tanh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d5a/structcv_1_1cudev_1_1tanh__func_3_01uchar_01_4.html#a217df735a2b55e8c29cc1877b65ffc96',1,'cv::cudev::tanh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/df/dc6/structcv_1_1cudev_1_1tanh__func_3_01uint_01_4.html#a8d6d358bc9a39244a0d829745d9b782f',1,'cv::cudev::tanh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d68/structcv_1_1cudev_1_1tanh__func_3_01ushort_01_4.html#a451a091258448763568c3148ecc90b1b',1,'cv::cudev::tanh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d09/structcv_1_1cudev_1_1TexturePtr.html#a37f533d175f7d132cfa0dbda2e9e4426',1,'cv::cudev::TexturePtr::operator()()'],['https://docs.opencv.org/4.2.0/df/df5/structcv_1_1cudev_1_1ThreshBinaryFunc.html#a52270b71a069ba892ffb1d99691466c3',1,'cv::cudev::ThreshBinaryFunc::operator()()'],['https://docs.opencv.org/4.2.0/da/d5e/structcv_1_1cudev_1_1ThreshBinaryInvFunc.html#a08286d7152097d42df33551d2459bc40',1,'cv::cudev::ThreshBinaryInvFunc::operator()()'],['https://docs.opencv.org/4.2.0/df/dd9/structcv_1_1cudev_1_1ThreshToZeroFunc.html#a5b5819f10125f84dc7ac7718b0515207',1,'cv::cudev::ThreshToZeroFunc::operator()()'],['https://docs.opencv.org/4.2.0/d8/d7e/structcv_1_1cudev_1_1ThreshToZeroInvFunc.html#a7b9e1075aefc2fbece94477f96efeab8',1,'cv::cudev::ThreshToZeroInvFunc::operator()()'],['https://docs.opencv.org/4.2.0/d0/d44/structcv_1_1cudev_1_1ThreshTruncFunc.html#a58e38cea97c6bc26b2a221b94af6b44a',1,'cv::cudev::ThreshTruncFunc::operator()()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a84b1f570775c927202a55ab1cccd9542',1,'cv::UMat::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a7679d5bea4421e360b90225d348e3fa3',1,'cv::UMat::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a0e245fe34228df0f31d3e3fdb6fa89d3',1,'cv::UMat::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#af4e69198d95654e9fe2bd03dd1feee38',1,'cv::UMat::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/d2/d83/structcv_1_1cudev_1_1UnaryNegate.html#a62a01b748a748f41e8151aa12feedd5b',1,'cv::cudev::UnaryNegate::operator()()'],['https://docs.opencv.org/4.2.0/dd/d01/structcv_1_1cudev_1_1UnaryTransformPtr.html#aeaea7fc6e3a4cebe1a5b4dbfd8aa916c',1,'cv::cudev::UnaryTransformPtr::operator()()'],['https://docs.opencv.org/4.2.0/d4/d57/structcv_1_1cudev_1_1UnaryTupleAdapter.html#ac5ef68bb68529b28058ef3728c5e8e28',1,'cv::cudev::UnaryTupleAdapter::operator()()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'cv::Vec::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'cv::Vec::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< _Tp, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< _Tp, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, 2 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, 2 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, nFeatures >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, nFeatures >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< float, 2 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< float, 2 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< float, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< float, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/da/d2c/structcv_1_1cudev_1_1WithOutMask.html#a0c1b6a4167eb490a4ccb48fd8c6fdacf',1,'cv::cudev::WithOutMask::operator()()'],['https://docs.opencv.org/4.2.0/dd/de4/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_01_4_01_4.html#a52971b170c17e2be804c1d31cb760264',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1 > >::operator()()'],['https://docs.opencv.org/4.2.0/d4/dff/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_01_4_01_4.html#a68f55e98fda4a897c29d2d4f49826f27',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2 > >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d2b/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_00_01Ptr3_01_4_01_4.html#af47fca22fa2dd342cd135d15a5015495',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2, Ptr3 > >::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html#a01fb6415bad2c6df91eb607f863fd9e5',1,'__gnu_cxx::subtractive_rng::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09463.html#a3cf37f56d2b37200d0708f75f872ada7',1,'__gnu_parallel::__accumulate_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09411.html#afba73305cf46d20618b0deb3cbd4a1ba',1,'__gnu_parallel::__adjacent_find_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09459.html#a56b55a96d25ead3f5a39c062913f7804',1,'__gnu_parallel::__count_if_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09455.html#a0e1e5ee862269d12a04fd59864f07e66',1,'__gnu_parallel::__count_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09435.html#a1e3e5bf39d889705dbb9424ac1a4fc01',1,'__gnu_parallel::__fill_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09419.html#ab86537005f7f266bbaebc18f9d44b077',1,'__gnu_parallel::__find_first_of_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09407.html#ab5c063395b4e4f3e1be257ac5327f8b2',1,'__gnu_parallel::__find_if_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09427.html#a96ab04030fc97ceace13df652312cca7',1,'__gnu_parallel::__for_each_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09431.html#aace006f0e22d008dbfbd4170ec504ff4',1,'__gnu_parallel::__generate_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09471.html#a5a619614699498f9a13f1c64d27005e6',1,'__gnu_parallel::__identity_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09467.html#aa518cf31e5b678e0ad8ed27ec50b995f',1,'__gnu_parallel::__inner_product_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09415.html#acce7eaf03f5dcb028e255f8b40ad9dfd',1,'__gnu_parallel::__mismatch_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09451.html#aac84e11aceb0e9a3a784639d4df228c3',1,'__gnu_parallel::__replace_if_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09447.html#af3f1faaa44808a57f241b03a0f9be9a5',1,'__gnu_parallel::__replace_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09439.html#a8292d668f885bee0747c9d154fb9a77e',1,'__gnu_parallel::__transform1_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09443.html#a4e0226a0b61723e0e8e716fb3a8be78f',1,'__gnu_parallel::__transform2_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09479.html#ac510e7f38f4ddc7d13db646cb65d2e25',1,'__gnu_parallel::_Nothing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09671.html#ac0da7b514eddc08518d496c93015bb39',1,'__gnu_parallel::_RandomNumber::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09671.html#a58e1450c9d06b629dde759438bc7d83c',1,'__gnu_parallel::_RandomNumber::operator()(uint64_t local_supremum)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11151.html#a01ee7eade182938e160f79cb9c68d73c',1,'__gnu_pbds::direct_mask_range_hashing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11155.html#a0b75e4a9b61ac153724d2c120d2a56dd',1,'__gnu_pbds::direct_mod_range_hashing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11143.html#a8974edcb80c2e1a8aee992a01b517b34',1,'__gnu_pbds::linear_probe_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#aba9450255401d4b96c50bf7c56d4c49a',1,'__gnu_pbds::lu_counter_policy::operator()() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#afa66044dd6264f0c6d6f1cfd05c2fe34',1,'__gnu_pbds::lu_counter_policy::operator()(metadata_reference r_data) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html#afa1064441fc28b323b7b28176686ef65',1,'__gnu_pbds::lu_move_to_front_policy::operator()() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html#a009f2dea97b29bdffa640258f86b6135',1,'__gnu_pbds::lu_move_to_front_policy::operator()(metadata_reference r_metadata) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11147.html#ae22be7552bf62d81aa93eb0b151e6016',1,'__gnu_pbds::quadratic_probe_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11783.html#aa6ced743b2988788dea80b762e85986d',1,'__gnu_pbds::sample_probe_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11787.html#aa99807ceec7e628556967db52a07bc0b',1,'__gnu_pbds::sample_range_hashing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11791.html#a0dd67bb1412f11f8898f67bb3cd1e8ec',1,'__gnu_pbds::sample_ranged_hash_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12083.html#ae4db417d4455178d78933ae2fae0c0c1',1,'__gnu_pbds::sample_trie_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#ac935e838124407bc51c0bf7c01933341',1,'__gnu_pbds::sample_update_policy::operator()() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#a6eefac672a1bb0513d6d3b145d35fd56',1,'__gnu_pbds::sample_update_policy::operator()(metadata_reference) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#a9f14ab1bc7aee93a77e4c73c37d1b9f5',1,'__gnu_pbds::tree_order_statistics_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#ac03a1d37b467c2f12926fcb78fb2803a',1,'__gnu_pbds::trie_order_statistics_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#a8366820208119a5e4179d91d09d8ea9b',1,'__gnu_pbds::trie_prefix_search_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a72dba48d3f9781e948c535e37e7eabeb',1,'gamma_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a286dd68452eebd137ec7be7852a58fca',1,'gamma_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a72dba48d3f9781e948c535e37e7eabeb',1,'gamma_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a286dd68452eebd137ec7be7852a58fca',1,'gamma_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae67f6ec56c5564a3521d734d90f35501',1,'normal_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a159f2f44c19a01c99cb937297d03604c',1,'normal_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae67f6ec56c5564a3521d734d90f35501',1,'normal_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a159f2f44c19a01c99cb937297d03604c',1,'normal_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#aec456e48e7dd746d11b2836368b7ed6d',1,'std::bernoulli_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a81e88f1000ed08018856b1b908acae12',1,'std::binomial_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#aff0946f83a897c9f8b42f88d9e6d24c6',1,'std::binomial_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#ae2c1bb8200f59e2e62b591676fffbf41',1,'std::cauchy_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a2ddd460528095405f9ee56cf681f306a',1,'std::chi_squared_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07995.html#a8ba28722822c984007c41986305ee762',1,'std::default_delete::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07999.html#a00890fd27c38569b6d907b8f93bd7833',1,'std::default_delete< _Tp[]>::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#ab96a2de7f6360a7fc295a0d03f0dfd2e',1,'std::discard_block_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a8213bca3ac8f3617fd3bec4f8ecd55f8',1,'std::discrete_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a11a94d907e89a229cfd4083cb8e6a14c',1,'std::exponential_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#a88eda5b7e1af374a061fdc284e8c2baa',1,'std::extreme_value_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#ab172a885f02391e497338955fbd5a5b7',1,'std::fisher_f_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#ab0bfbd15574ba442c644604dc18c4750',1,'std::function< _Res(_ArgTypes...)>::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a72dba48d3f9781e948c535e37e7eabeb',1,'std::gamma_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a286dd68452eebd137ec7be7852a58fca',1,'std::gamma_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a4a41c317cae02db9d8cc20dbbcd4d77d',1,'std::geometric_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a61bc80ca1745e63a5f22307498737844',1,'std::independent_bits_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#ae42fad7d735fb5d8d96076f70f2f65d4',1,'std::linear_congruential_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#ad9d4f2f1dd2404eeb399f7609e50f1fb',1,'std::locale::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#ae6fb96729b574441550992a32599df9a',1,'std::lognormal_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#a1c8275129594f6b1ac0830e2550698dd',1,'std::negative_binomial_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae67f6ec56c5564a3521d734d90f35501',1,'std::normal_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a159f2f44c19a01c99cb937297d03604c',1,'std::normal_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a9cd86c19e7864fe4f6e7fec1965210e9',1,'std::piecewise_constant_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a3853eb2d024be1171d980339eefb0470',1,'std::piecewise_linear_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a4ca984da5920a260845933c37d20cc2e',1,'std::poisson_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a09b00c6571fa3099f12918955723f41d',1,'std::poisson_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#af3cc39eaa42c2d1177cd98fa8e2e91e3',1,'std::shuffle_order_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a79b8f920240c03c968f96fc34b15c409',1,'std::student_t_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a7b6aa59d4719950a6014d38e1559295c',1,'std::subtract_with_carry_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a40babba47578a39b3bdc5f9b56a64268',1,'std::uniform_int_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#ae424a70312170d3b285bf6039b58cb58',1,'std::uniform_real_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a7f3883c7078a32e87c72157e91776416',1,'std::weibull_distribution::operator()()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AMDOrdering.html#afce433557abcba9e49fa81581a58fa51',1,'Eigen::AMDOrdering::operator()(const MatrixType &mat, PermutationType &perm)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AMDOrdering.html#a7f3fd7224b084f0f5655c97ea8eb6466',1,'Eigen::AMDOrdering::operator()(const SparseSelfAdjointView< SrcType, SrcUpLo > &mat, PermutationType &perm)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1COLAMDOrdering.html#a708cb20191dcd79856d922f262405946',1,'Eigen::COLAMDOrdering::operator()()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#af9fadc22d12e48c82745dad534a1671a',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::operator()(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#ab3dbba4a15d0fe90185d2900e5ef0fd1',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::operator()(Index row, Index col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#a0171eee1d9e582d1ac7ec0f18f5f615a',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::operator()(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#ae6ba07bad9e3026afe54806fdefe32bb',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::operator()(Index row, Index col)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1NaturalOrdering.html#aa39e772105ed66da9e909f2a9385be37',1,'Eigen::NaturalOrdering::operator()()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a09fce82b9bdedb5deb2b223a3d716d3f',1,'Eigen::Transform::operator()(Index row, Index col)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a9672c84cb1477eee118be144e7e5d581',1,'Eigen::Transform::operator()(Index row, Index col) const'],['https://nlohmann.github.io/json/doxygen/structstd_1_1hash_3_01nlohmann_1_1json_01_4_aec1567d1fa47dbe5b77954dce3a55b64.html#aec1567d1fa47dbe5b77954dce3a55b64',1,'std::hash< nlohmann::json >::operator()()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga68c6b644dd17b10637cf74117c44e35e',1,'operator()()(Global Namespace)']]], + ['operator_2a_311',['operator*',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a73e4a0844474b25bf254b08c7e4978d6',1,'cv::FileNodeIterator::operator*()'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a11df3b7dbaf0e16ddb430eab3b62e78f',1,'cv::LineIterator::operator*()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ad54179860880cbc148f2708c5b1fa2f6',1,'cv::MatConstIterator::operator*()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a44e02be61a20baa1ab83de13c7c956b4',1,'cv::MatConstIterator_::operator*()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac66fa81bbfc418c535a7f9f49a900554',1,'cv::MatExpr::operator*(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7f68410debc724a5be5235977b902be5',1,'cv::MatExpr::operator*(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7994c3ff3973cc56aac839dc8683ba51',1,'cv::MatExpr::operator*(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a951bede696efc7ad39b2326c257cb9b5',1,'cv::MatExpr::operator*(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae3d5b4a180f62f30b5874243af312ebb',1,'cv::MatExpr::operator*(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a54d49dc23f7a659f61ec5401b9c48d05',1,'cv::MatExpr::operator*(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaac1439d54057753cddc9330f8f56ea6',1,'cv::MatExpr::operator*(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2eb63d9f7b2d398c8714239114ff2b4e',1,'cv::MatExpr::operator*(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a31e53f019aa164af7e7276440f57f497',1,'cv::MatExpr::operator*(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69bdf2007fa634306dea2e7065f839f9',1,'cv::MatExpr::operator*(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac66fa81bbfc418c535a7f9f49a900554',1,'cv::MatExpr::operator*(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7f68410debc724a5be5235977b902be5',1,'cv::MatExpr::operator*(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7994c3ff3973cc56aac839dc8683ba51',1,'cv::MatExpr::operator*(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a951bede696efc7ad39b2326c257cb9b5',1,'cv::MatExpr::operator*(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae3d5b4a180f62f30b5874243af312ebb',1,'cv::MatExpr::operator*(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a54d49dc23f7a659f61ec5401b9c48d05',1,'cv::MatExpr::operator*(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaac1439d54057753cddc9330f8f56ea6',1,'cv::MatExpr::operator*(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2eb63d9f7b2d398c8714239114ff2b4e',1,'cv::MatExpr::operator*(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a31e53f019aa164af7e7276440f57f497',1,'cv::MatExpr::operator*(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69bdf2007fa634306dea2e7065f839f9',1,'cv::MatExpr::operator*(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a30669620dc39593b9c21b373fd83cac5',1,'cv::MatIterator_::operator*()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'cv::Matx::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'cv::Matx::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'cv::Matx::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'cv::Matx::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'cv::Matx::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'cv::Matx::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'cv::Matx::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'cv::Matx::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< _Tp, cn, 1 >::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< _Tp, cn, 1 >::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< _Tp, cn, 1 >::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< _Tp, cn, 1 >::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< _Tp, cn, 1 >::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< _Tp, cn, 1 >::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 1, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 1, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 1, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 1, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 1, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 1, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 2 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 2 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 2 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 2 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 2 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 2 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 4, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 4, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 4, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 4, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 4, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 4, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, cn, 1 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, cn, 1 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, cn, 1 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, cn, 1 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, cn, 1 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, cn, 1 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 2, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 2, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 2, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 2, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 2, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 2, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 3, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 3, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 3, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 3, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 3, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 3, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, cn, 1 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, cn, 1 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, cn, 1 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, cn, 1 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, cn, 1 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, cn, 1 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float_type, 4, 4 >::operator*(int alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float_type, 4, 4 >::operator*(float alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float_type, 4, 4 >::operator*(double alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, l > &a, const Matx< float_type, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, const Vec< float_type, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float_type, 4, 4 >::operator*(int alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float_type, 4, 4 >::operator*(float alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float_type, 4, 4 >::operator*(double alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, l > &a, const Matx< float_type, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, const Vec< float_type, n > &b)'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a603a8a1c3cc866977c8fbd8b55314c86',1,'cv::MatxCommaInitializer::operator*()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a603a8a1c3cc866977c8fbd8b55314c86',1,'MatxCommaInitializer< _Tp, m, 1 >::operator*()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a98a3906afc1a4005f761124f3fd22e8e',1,'cv::util::optional::operator*()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a37e1e46df264e1fddf325db1e6903c5b',1,'cv::util::optional::operator*() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac2116f5bce2914d578953c6ac8c0da16',1,'cv::softdouble::operator*()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab2ccc99b90013df8b9cf49f6c63842ff',1,'cv::softfloat::operator*()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a1db341e36da96bff57ce3c8d16aa85a2',1,'cv::SparseMatConstIterator_::operator*()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a26262be0fb6504badd2d515e7dbbd648',1,'cv::SparseMatIterator_::operator*()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'cv::Vec::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'cv::Vec::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'cv::Vec::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'cv::Vec::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'cv::Vec::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'cv::Vec::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'cv::Vec::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'cv::Vec::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< _Tp, 4 >::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< _Tp, 4 >::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< _Tp, 4 >::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< _Tp, 4 >::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< _Tp, 4 >::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< _Tp, 4 >::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 2 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 2 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 2 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 2 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 2 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 2 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 2 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 2 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 3 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 3 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 3 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 3 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 3 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 3 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 3 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 3 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 4 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 4 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 4 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 4 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 4 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 4 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 4 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 4 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 2 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 2 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 2 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 2 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 2 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 2 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 2 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 2 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 3 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 3 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 3 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 3 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 3 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 3 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 3 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 3 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d1/d3e/classcv_1_1VecCommaInitializer.html#a43e67fe37475c2c6e7081285cb7a8f56',1,'cv::VecCommaInitializer::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a09753efe38fc494639cbbe005409fe51',1,'__gnu_debug::_Safe_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a8e237d9370458e65ea6141b677e8e8f8',1,'__gnu_debug::_Safe_local_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#a89e62967a92648f52f3da16144bf9b75',1,'__gnu_parallel::_GuardedIterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#aeebd8eab002abaceeeeedbb0850ae617',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11631.html#aab710c87290d148b6dd2eb260ff27a1d',1,'__gnu_pbds::detail::bin_search_tree_node_it_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a50d89bdcb26164ff380a312673cf0f06',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a50d89bdcb26164ff380a312673cf0f06',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a60ad369139de2b800a5a729f10b992bb',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a60ad369139de2b800a5a729f10b992bb',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11867.html#a89338f1c18b5234bf80ef61c8f839359',1,'__gnu_pbds::detail::ov_tree_node_it_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a951a43bd97e277ad638e8cf8229d0af3',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11951.html#a575ff0f4d10725779405d8e83dc27463',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a09753efe38fc494639cbbe005409fe51',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a09753efe38fc494639cbbe005409fe51',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#aa36fe65e861c9fe0e67b77f28d0fea0b',1,'const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a44f292f812c56ddf38a1cded7175fa22',1,'iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#aa36fe65e861c9fe0e67b77f28d0fea0b',1,'point_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a07f5dff121401de22bbc2647de595243',1,'point_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a2e044fd0c71fba38157d3aa588be4518',1,'std::auto_ptr::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#a07c1b7a9f42341013f7a44752596d16e',1,'std::back_insert_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#a1686a970fd21798542dd32e3c2208b95',1,'std::front_insert_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a1a406c868feb4c886b002870abeb8546',1,'std::insert_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#aa68118742e48a3296a39611184764153',1,'std::istreambuf_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#a179357ce2cd1d4a53d9c0e5efb65e4df',1,'std::ostreambuf_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a89ee258fe95b81e17fb0eaf4cb0fd565',1,'std::regex_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a0ae03837c2bb4c283a500b70e00743bd',1,'std::regex_token_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a7af5d174f9cb1016e5028e6a8716753b',1,'std::reverse_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'std::unique_ptr::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Codecvt >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Res_type >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Result< _Res > >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Result_base >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< bool[]>::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#ad0a428546d0ff7ed06cca4c4a1e4522a',1,'Eigen::AngleAxis::operator*(const AngleAxis &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a36fa315e0326beacbf249b56fcd0596e',1,'Eigen::AngleAxis::operator*(const QuaternionType &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#acdec7200dd68b70b615bcda9659fed26',1,'Eigen::AngleAxis::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ac57e5a22f1646e04a4f8b4cba3825928',1,'Eigen::HouseholderSequence::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html#ada8389f291839964d7b481464f0e4e94',1,'Eigen::JacobiRotation::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a36fb95c37f0a454e0e2e5cb120b2df7f',1,'Eigen::MatrixBase::operator*(const DiagonalBase< DiagonalDerived > &diagonal) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae2d220efbf7047f0894787888288cfcc',1,'Eigen::MatrixBase::operator*(const MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a36fb95c37f0a454e0e2e5cb120b2df7f',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator*(const DiagonalBase< DiagonalDerived > &diagonal) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae2d220efbf7047f0894787888288cfcc',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator*(const MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a36fb95c37f0a454e0e2e5cb120b2df7f',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator*(const DiagonalBase< DiagonalDerived > &diagonal) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae2d220efbf7047f0894787888288cfcc',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator*(const MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'Eigen::PermutationBase::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'Eigen::PermutationBase::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a3f404810659d5095a6db906a4728ddfb',1,'Eigen::PermutationBase::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a3f404810659d5095a6db906a4728ddfb',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a3f404810659d5095a6db906a4728ddfb',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a3f404810659d5095a6db906a4728ddfb',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a3f404810659d5095a6db906a4728ddfb',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'Eigen::QuaternionBase::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#adbfbf2d1ccdf50999bad7688348f4ac2',1,'Eigen::Rotation2D::operator*(const Rotation2D &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ad0ad69c781232313b7d01f981148f230',1,'Eigen::Rotation2D::operator*(const Vector2 &vec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'Eigen::RotationBase::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'Eigen::RotationBase::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'Eigen::RotationBase::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'Eigen::RotationBase::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'Eigen::RotationBase::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'Eigen::RotationBase::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Derived, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Derived, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Derived, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Derived, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'RotationBase< Derived, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'RotationBase< Derived, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a615ece720e9826703b399dfaeaba1ae0',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a38f506f2d3617685d1f684cdbc4f8dd4',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af18c39fdc7783c63766ba22ce0e784c3',1,'Eigen::SelfAdjointView::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a2fb955589b841c308dc875e3ab3193e8',1,'Eigen::SelfAdjointView::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af18c39fdc7783c63766ba22ce0e784c3',1,'SelfAdjointView< const Derived, UpLo >::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a2fb955589b841c308dc875e3ab3193e8',1,'SelfAdjointView< const Derived, UpLo >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'Eigen::SparseMatrixBase::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< Transpose< MatrixType > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a887e3b5fa468af8413276141ddc8bb93',1,'Eigen::SparseSelfAdjointView::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a9d1e5ef26775e3b43be08fd4ae191aa8',1,'Eigen::SparseSelfAdjointView::operator*(const SparseMatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a346ad7b3c5c8769c0fe29ae9e921b429',1,'Eigen::SparseSelfAdjointView::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a9bbe41a5c050f8067d4fe77372eb0b7a',1,'Eigen::SparseSelfAdjointView::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a887e3b5fa468af8413276141ddc8bb93',1,'SparseSelfAdjointView< const Derived, UpLo >::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a9d1e5ef26775e3b43be08fd4ae191aa8',1,'SparseSelfAdjointView< const Derived, UpLo >::operator*(const SparseMatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a346ad7b3c5c8769c0fe29ae9e921b429',1,'SparseSelfAdjointView< const Derived, UpLo >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a9bbe41a5c050f8067d4fe77372eb0b7a',1,'SparseSelfAdjointView< const Derived, UpLo >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ab3d93a2aba9d06e7d134798f92617da7',1,'Eigen::Transform::operator*(const DiagonalBase< DiagonalDerived > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a257ab8b9141982bd6f56771ba822526f',1,'Eigen::Transform::operator*(const EigenBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a7e75d983600d35b603f740a3a28bbc6c',1,'Eigen::Transform::operator*(const Transform &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ad4fc26aef2abfb9fdadb7d64aaf58c31',1,'Eigen::Transform::operator*(const Transform< Scalar, Dim, OtherMode, OtherOptions > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a8941cc25b120ff7ee7b435150ba699b3',1,'Eigen::Transform::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a090b3d825f52110533fbea6d0d127ea0',1,'Eigen::Transform::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a2289ae59c8f871d9d9c73ba7eeb035f8',1,'Eigen::Translation::operator*(const EigenBase< OtherDerived > &linear) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a62a95caa45e0aa178e0b2759c78874b1',1,'Eigen::Translation::operator*(const MatrixBase< Derived > &vec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a37840d7fa515418e143593efbd21c6b3',1,'Eigen::Translation::operator*(const RotationBase< Derived, Dim > &r) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#ac0e625c8d90f899be9c73b77592a003f',1,'Eigen::Translation::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#aa79f1217e27556e0524260e172a0b081',1,'Eigen::Translation::operator*(const Translation &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a156c8003ff3830756727e805cf98c0ab',1,'Eigen::Translation::operator*(const UniformScaling< Scalar > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a918cdd281bce3363e0e242b22bccbbec',1,'Eigen::Translation::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#ad21c964c4d5dff8aa496558ef74731f1',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#aea3c3ed2813ff9e48adc14fa7bbd9360',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator*'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a8abd57298d10bd620bdfc459d22e8add',1,'Eigen::UniformScaling::operator*(const MatrixBase< Derived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#ad8c9401526e9ade727036b6d255fbdc0',1,'Eigen::UniformScaling::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a19c405341f2c861eb0ddfc4f760fecf8',1,'Eigen::UniformScaling::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#af3044cffe5703a1946c33a953b0f9bb6',1,'Eigen::UniformScaling::operator*(const UniformScaling &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a8f79e131479dbe709ee1173b1be9a8f0',1,'Eigen::UniformScaling::operator*(const MatrixBase< Derived > &matrix, const UniformScaling< Scalar > &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'Eigen::VectorwiseOp::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Derived, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Derived, Vertical >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator*()'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gac57f9a35a5d4d1d3ba23d7871113cbd3',1,'cv::operator*(const Affine3< T > &affine1, const Affine3< T > &affine2)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gae9c102e6fd783bcf801e3432aca22e7b',1,'cv::operator*(const Affine3< T > &affine, const V &vector)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga548eb6a25623179405f13cad3954c01e',1,'cv::operator*(const Affine3f &affine, const Vec3f &vector)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaa607fd3c66c5c525cc4d39dc83ffd177',1,'cv::operator*(const Affine3d &affine, const Vec3d &vector)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga902a09c161f9ef0eedcf1414e58f3672',1,'cv::operator*(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487b453f9836d06d7324744d40dad0b',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6515905db0f226f4645878f458e4ff9',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf583d2c1fcd51d86094e1f30b2a58a2',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e1bad5a79815eec73d07827b885d1cd',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f79b898d0d82738072b4c49ef4086',1,'cv::cudev::operator*(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5a0a9a53dee95c42e80578e6440b218',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf27cecd7f8e200f4de479660583a8d15',1,'cv::cudev::operator*(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7f8cfe1eaafe131a814ee152b9a6e5a',1,'cv::cudev::operator*(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12aeb64e97cdb928290bf3fa82f05269',1,'cv::cudev::operator*(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fa7f2aa7dd5048da167a76587a44028',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93118d92ecb3c188a5c01ba769ba299e',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1a615302d17eda49ad2cec76c41859',1,'cv::cudev::operator*(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca535315088057b26c801a5705c1483',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510f2b0f9088282d3d47bf3093a38f78',1,'cv::cudev::operator*(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga163edd6ad357b0a6b49d3ad55b84f88c',1,'cv::cudev::operator*(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c75809716911fce2e047b0fb0c984b',1,'cv::cudev::operator*(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9db0eb6fb6dacf76ef4e8c8c304ddd9c',1,'cv::cudev::operator*(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b5811bca4633d9a78a6cae2adfa3dff',1,'cv::cudev::operator*(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafda944b16459e9a69661d33e7607fb41',1,'cv::cudev::operator*(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c7c955caf1909eb3c94363e1c7d3cb5',1,'cv::cudev::operator*(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4aaeb25bb41c3e4d44a51b4930532426',1,'cv::cudev::operator*(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43ee6bae7bda7ed2faf47b555790cb71',1,'cv::cudev::operator*(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02baabd5114aa4d102ed246afc6ce624',1,'cv::cudev::operator*(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga090d742c550d7e79878be81be9bdb2d2',1,'cv::cudev::operator*(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18a1ba838a8be508e64a43158cc45dfb',1,'cv::cudev::operator*(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e14d050010ca7c994471bf8467e32d3',1,'cv::cudev::operator*(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d7b1523f9c29c8a05ad2e41f191a2fe',1,'cv::cudev::operator*(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa1246b30b73eb70bba00a86fcd66395',1,'cv::cudev::operator*(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba88bd93ccad1c92db994fe051e342b',1,'cv::cudev::operator*(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98f94ba39b97b682e67464d85209e95',1,'cv::cudev::operator*(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84372ff1d3b6a2526b19964595096039',1,'cv::cudev::operator*(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3cc2c07d0405e5bef08000f75eb39e8',1,'cv::cudev::operator*(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c697c1a0f04f6e63a5f9da4ac327e85',1,'cv::cudev::operator*(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc87fb00c079b8edcfccd10ab13af8d2',1,'cv::cudev::operator*(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf59a024579c49c38a26a8a27e58297c1',1,'cv::cudev::operator*(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf912af0788d82a8d5aff820aaa99059',1,'cv::cudev::operator*(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88c3308c7efb95649564d8be2691284d',1,'cv::cudev::operator*(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb953af5f4125ba0182c6f8917300f90',1,'cv::cudev::operator*(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac65246dd4280d78429ab84b3fc9c2870',1,'cv::cudev::operator*(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f3e6aea5eb84905c559ef24412fa56',1,'cv::cudev::operator*(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga414e54087adc42f28fa754230dbab979',1,'cv::cudev::operator*(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac2d56a48c008a7e47b6310b109b376e',1,'cv::cudev::operator*(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d7b82717c159efcaadead58ee8142a8',1,'cv::cudev::operator*(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe5bfda78209600b7280b4bbd3cc3762',1,'cv::cudev::operator*(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae528d51efc3d013a608832c80bed2f8c',1,'cv::cudev::operator*(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga849d54a360b19427092bd7ce395da7c5',1,'cv::cudev::operator*(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f187e66cff592d0712ceaaa605e038',1,'cv::cudev::operator*(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac0afe2a5142d8098d2482c3814f8671',1,'cv::cudev::operator*(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5a08e2ac528655b1571f7fcb28c3c0',1,'cv::cudev::operator*(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5333891f8e975c6bc4e8f5813545b4b',1,'cv::cudev::operator*(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a3078c6a237576551f2d32606e32f10',1,'cv::cudev::operator*(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed7245cd9d9405b2de08c4b21fa08a5',1,'cv::cudev::operator*(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc381907b598468405b30d25a06c8ff',1,'cv::cudev::operator*(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e97c44127431ce49735fa92dbe4b25f',1,'cv::cudev::operator*(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9424ca0c0b214254e9adecb61adb2e5a',1,'cv::cudev::operator*(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae410ccbe1a6a58649302ccebf3c68949',1,'cv::cudev::operator*(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3b2a2d0d9a613d056c8523e155b674c',1,'cv::cudev::operator*(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85f5cd22ec760e4a2c14c78d80f4670d',1,'cv::cudev::operator*(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37e9268a08593a1e1bb839e2ce50ede9',1,'cv::cudev::operator*(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2429e2ed1796030785a93567ecf1776f',1,'cv::cudev::operator*(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1c28bd26127b812ce97c907b32fc9fc',1,'cv::cudev::operator*(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9cc4a289ee92829765bdf1958bc6e05',1,'cv::cudev::operator*(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e8f6dbe9d17cbd6cf04375fc5fca9ae',1,'cv::cudev::operator*(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f2fa27b61586fef88ab71db6e08faf0',1,'cv::cudev::operator*(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf9988841348e5856a943b777002e2b',1,'cv::cudev::operator*(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b8a526c1994b95e9ce76e3614acc86',1,'cv::cudev::operator*(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23920ad7c06382a913e3fcf217459a0b',1,'cv::cudev::operator*(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e9ba42884866db4b183e9028fd8b04f',1,'cv::cudev::operator*(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf5b25603db42e2eb11c8fdd17a7f25f',1,'cv::cudev::operator*(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c10d68845ebb0598810e51a2eba805c',1,'cv::cudev::operator*(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65f2d1823549a4b6dc52ef6d3054ba56',1,'cv::cudev::operator*(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1f3d4142ff834d438ef16a84fb23355',1,'cv::cudev::operator*(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fcd3e4a9f5ffcb684e3945e713a190f',1,'cv::cudev::operator*(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3caace9001357c38394f006fb1f634a',1,'cv::cudev::operator*(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2076958e894ca52570151a2308d8c781',1,'cv::cudev::operator*(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2741381920372f76817c4b9b76e28137',1,'cv::cudev::operator*(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2394ee2867506f375e14a36018519d8a',1,'cv::cudev::operator*(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6028638b717b193d90a9bbdd76a2797',1,'cv::cudev::operator*(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf250948634b71efc0820d731faa6cda1',1,'cv::cudev::operator*(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc861ca7430feace92266e538ed54b24',1,'cv::cudev::operator*(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08650b887f60c9a6c242c79f09c0cb69',1,'cv::cudev::operator*(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5522c68d2ae330209abc2765d6b50992',1,'cv::cudev::operator*(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacef4b96ed094bbed58d13a7071d1a87a',1,'cv::cudev::operator*(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5bd92d93ed5dbf9714a033550a83ed',1,'cv::cudev::operator*(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac18603d03fbcfdfd23751709f2238029',1,'cv::cudev::operator*(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5afec7fb5b0492668e86c8181f441aa',1,'cv::cudev::operator*(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2943f13db2702fddce4557a2e957c565',1,'cv::cudev::operator*(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32454c9d98afba5f7144a92cd6bf5acb',1,'cv::cudev::operator*(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16a1d022b4026918e85eaf28ac606a81',1,'cv::cudev::operator*(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8c6dcb676ea367c9e1dd89fd4f0abf4',1,'cv::cudev::operator*(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27de604fa033669bc0555199b31ef777',1,'cv::cudev::operator*(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1edec141c59b8a684d2592d1420949a1',1,'cv::cudev::operator*(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07a0d9f472b1baec9f5eabfff9d1eaf7',1,'cv::cudev::operator*(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6be4a7723c490f8b150c714436100e12',1,'cv::cudev::operator*(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddd96b00b4b034d26ce474707a4e5e1d',1,'cv::cudev::operator*(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7ef727c5051a2421616f0517740d984',1,'cv::cudev::operator*(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11b210a1793cf8e3d930c11dfda9ae6e',1,'cv::cudev::operator*(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55db9f51fac5b573deb32220a631ca9',1,'cv::cudev::operator*(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28a4888db08301e51da23d006f382653',1,'cv::cudev::operator*(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7020c56e082be84fca69fa2c9916a4e',1,'cv::cudev::operator*(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c25ca47380b7997200bb81a88f0323',1,'cv::cudev::operator*(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7b92c373c28a5c4e44617cbbe8b28d8',1,'cv::cudev::operator*(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dff9b27265d9a0d0b246618c2f6d190',1,'cv::cudev::operator*(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e7e1c4649f286432072ebf0bbcaa069',1,'cv::cudev::operator*(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98148cbe18fa5a1fe9cc37af9b2944da',1,'cv::cudev::operator*(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8af39ddbfd14cda64dc1ea8312ddeaab',1,'cv::cudev::operator*(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25a1baeb7c9b07639b599dcafb0a7dd1',1,'cv::cudev::operator*(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cfca580e4aed7f30b018f5b3b5f04de',1,'cv::cudev::operator*(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28a09636e8ddc34502754ef3cc45736',1,'cv::cudev::operator*(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd4d86a80e9a8ba4d0b8191946a7c7e4',1,'cv::cudev::operator*(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga500f12286f4bde3313357ee9b77522d8',1,'cv::cudev::operator*(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b1789f57a51f5db4560fe91f26bbd1',1,'cv::cudev::operator*(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5723f7cf916b1c9455c8581abcdeb505',1,'cv::cudev::operator*(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0e897f09e26316ca2aa0cbb965e1835',1,'cv::cudev::operator*(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga314f5a0e14f5b478c6c979776c26d203',1,'cv::cudev::operator*(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819a0d444655998d3ae70cd93b283319',1,'cv::cudev::operator*(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a5340751b48d6b199875c361804465',1,'cv::cudev::operator*(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bce5ffd4058a6549f3bb651f50bfe46',1,'cv::cudev::operator*(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ca0ada3b453db74593720374e9af90f',1,'cv::cudev::operator*(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2228f02f69514b9ea9c3bd30df71d0',1,'cv::cudev::operator*(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f24178f4139fa88be47e2b9f7126eb',1,'cv::cudev::operator*(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82ad067165475e005f75eb902cbcf2f6',1,'cv::cudev::operator*(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eca4d9d17555bb68127757943e54495',1,'cv::cudev::operator*(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddaa9f9bc413848a741a108556de7f66',1,'cv::cudev::operator*(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d937bc5dd036bbbc645b81f260b5b5',1,'cv::cudev::operator*(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3cce3391058528e77d01b2f2aaf28f4',1,'cv::cudev::operator*(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd32b6bf1571865c29d46f1ac091c5d',1,'cv::cudev::operator*(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09b06dc7f40394668ea338909fdb11da',1,'cv::cudev::operator*(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2561dcb50f1b343e79d929c85d9d6af2',1,'cv::cudev::operator*(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab96739276183d3d037db1b31b54f98cb',1,'cv::cudev::operator*(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bc8a2714623a07f6d32a01c5a02a19d',1,'cv::cudev::operator*(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e546e55ec80d5ce6e41dd72c8091ad7',1,'cv::cudev::operator*(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0f13827bf653baef99ce65166394e7f',1,'cv::cudev::operator*(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19620047188467d968634de432862b30',1,'cv::cudev::operator*(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9f8c286132b32a1d0d2f136b9304e9f',1,'cv::cudev::operator*(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89bebd81801426221358914f44b9399f',1,'cv::cudev::operator*(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad909b1577d5bc471b8ebc7d934253736',1,'cv::cudev::operator*(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ddea16553b01373469d460fd8f5f9',1,'cv::cudev::operator*(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd372b32bcd38be3dd4261d657c742fa',1,'cv::cudev::operator*(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e03853be024cf4a58640b575d7b6122',1,'cv::cudev::operator*(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b0ea30f8320cf30ca3b42aa699e1d11',1,'cv::cudev::operator*(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4976047aad73ae11f14d5311b5efc643',1,'cv::cudev::operator*(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d268df51117be47d5a192550113b2bb',1,'cv::cudev::operator*(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga886827c0f13b44c8fa578f3d4bab6187',1,'cv::cudev::operator*(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06546a623ef3a0292e0d0b5b9a241596',1,'cv::cudev::operator*(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f215d83712628eb64664ca8edc729c3',1,'cv::cudev::operator*(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322e5725d39b6a56b10217744fd54c84',1,'cv::cudev::operator*(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ca17de0407d90a3cac404220b157d5',1,'cv::cudev::operator*(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac169dc02de88236dc3287630549e7c32',1,'cv::cudev::operator*(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d60d4ea2cc22ce5ae0cf0950b2148dd',1,'cv::cudev::operator*(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95b4ecd54e292812be0faf0a93687fa5',1,'cv::cudev::operator*(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9246aa07ab9cb8d3a42db71f45d804a',1,'cv::cudev::operator*(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed19b40b852d4b05f7af20906f02df96',1,'cv::cudev::operator*(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa8c599bd31954a5687b8a1ae2ba1696',1,'cv::cudev::operator*(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ea6d03ee2c62f728d3fbfe71f16b259',1,'cv::cudev::operator*(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dabe0e00519ed1f069e7682e7dc28d2',1,'cv::cudev::operator*(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga916d16970792f1444932d3551460e762',1,'cv::cudev::operator*(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0acc20bf74d011ff6eb0263efa31c91',1,'cv::cudev::operator*(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacea516a696d7e15b81d71bc335a1be2b',1,'cv::cudev::operator*(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67e2f781ad85fbc5b4b2759018ef0bc',1,'cv::cudev::operator*(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cee4b43501cb0d54db315a9be3c00be',1,'cv::cudev::operator*(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eb8ba99e7883f7e5208da1d56a63ea8',1,'cv::cudev::operator*(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd127c751ea3d9b32c47a50503405eaa',1,'cv::cudev::operator*(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea8d0ec3ad321a074118524061e9de9b',1,'cv::cudev::operator*(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae972a64880e7f11f0b512bf4862c988d',1,'cv::cudev::operator*(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae7124c60811e471f4ccea775e6a8105',1,'cv::cudev::operator*(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefcfe41bdbb40358a627620664e43087',1,'cv::cudev::operator*(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga532206b6078098de41bdb7cdee843242',1,'cv::cudev::operator*(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6dde37f01013af843248fa57df5a4705',1,'cv::cudev::operator*(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d83c6f1c934d58b0db96fb9b1031e4',1,'cv::cudev::operator*(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0555787fcd7d58a8c94d0a4369c947',1,'cv::cudev::operator*(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5305d06b4d7893f8d4fb352f6941d49',1,'cv::cudev::operator*(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbccb0f7cfedd9faa5375d17e7acd9e6',1,'cv::cudev::operator*(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d713228fed5e4b46d913ee514c4702',1,'cv::cudev::operator*(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga416c75338bba0071cde9be85bdd14c8f',1,'cv::cudev::operator*(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c4bf653481daa71869c6ec80f7ac7c',1,'cv::cudev::operator*(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62bf09c0d8b2a28f9de71abb998ab55f',1,'cv::cudev::operator*(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e873b6129892d4d634e0b541aa5a356',1,'cv::cudev::operator*(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db9280a8455e340346203f8c8dbc45d',1,'cv::cudev::operator*(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bfdc89f82d9717003387c1d237f5923',1,'cv::cudev::operator*(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f86fba4880a36b6a7bd2394e161b34',1,'cv::cudev::operator*(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f952a21290dc2760de145e020239a6',1,'cv::cudev::operator*(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga530e3a25447a5113790059cf574c9d4d',1,'cv::cudev::operator*(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga939ac4107ae2ef44cdba119f11a3e41b',1,'cv::cudev::operator*(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa226675e3d5fa565377951e1fe2adf26',1,'cv::cudev::operator*(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga032a606b459e22962751c5b5cb56721c',1,'cv::cudev::operator*(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42182588882947c6d2ea60418ccfa53f',1,'cv::cudev::operator*(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657fd69c2c2dbaa5bbd8f38e9086600c',1,'cv::cudev::operator*(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga913025bdda9cfaf0a1d39fe6f912d32e',1,'cv::cudev::operator*(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcfcf7d4b858ae3c794028e7c55b20a',1,'cv::cudev::operator*(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b854a847e119bfbc02c2cc5de31787',1,'cv::cudev::operator*(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb615b962e904782d9555a089708366d',1,'cv::cudev::operator*(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b093cf980d6cabad1afbc4954ce86f9',1,'cv::cudev::operator*(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0613453550f4199c8fe8734f2e7ef4cb',1,'cv::cudev::operator*(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb4e9c2226edb173d19a520c69297f57',1,'cv::cudev::operator*(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a441729d11f327aa925f6980920c810',1,'cv::cudev::operator*(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c93c9c99656ffb2dcd5abda39efae1d',1,'cv::cudev::operator*(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b2fee3c015fbd9323b9951b595639f0',1,'cv::cudev::operator*(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1881d24ddb09d043dcd7c859e61b16',1,'cv::cudev::operator*(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c0fa10b8bed67d42ab55dc2208107f8',1,'cv::cudev::operator*(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga027915df6e568365ecfa3e12a5e677f4',1,'cv::cudev::operator*(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58bcfcef533a71a0a1a9ee50738d257c',1,'cv::cudev::operator*(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5920528b65944ed40e4497447d8e0316',1,'cv::cudev::operator*(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44418d16b815d5057b17b2a34246734c',1,'cv::cudev::operator*(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d29745317c743241a4d85cedc91bf88',1,'cv::cudev::operator*(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cbf71951b93eea0b5a076f7d18a7451',1,'cv::cudev::operator*(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e048d5a2db1da9b1575aebd01b047bb',1,'cv::cudev::operator*(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga663d40c6e2002f25c436d52d82b2c690',1,'cv::cudev::operator*(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7bd29f68c70d0a3b1b705f889140d0e',1,'cv::cudev::operator*(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4030fb67021c4472688f397dc551adb',1,'cv::cudev::operator*(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3476d190ac862ed33f50e5178938f6a',1,'cv::cudev::operator*(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04af26fcf72bcf1ea89a3406eb81dc56',1,'cv::cudev::operator*(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01861575c1321bb4e37ba4ff91b8f7dc',1,'cv::cudev::operator*(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9601e46278afcfaa677985f801a57d76',1,'cv::cudev::operator*(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab805b6e07f01115a8e08afa3108525',1,'cv::cudev::operator*(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a3751f548f681546118362181963dae',1,'cv::cudev::operator*(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8075bb13162203e07a2b9276b42aa063',1,'cv::cudev::operator*(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f7ee241d6ee1a6a20c735286770c6f',1,'cv::cudev::operator*(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga789c8bfcf46261d2c0c69901bfc53c61',1,'cv::cudev::operator*(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33a577374fa11cf0c7d9debceed5d70b',1,'cv::cudev::operator*(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab14d1e659db18b0c671ca9dbf9e0048f',1,'cv::cudev::operator*(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfad4cd4b1abf7ed115e9261d4fafaf1',1,'cv::cudev::operator*(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95434e47c47ea25a3a6d9f1906258286',1,'cv::cudev::operator*(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66aff7a10720233331180655c8be700d',1,'cv::cudev::operator*(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gac57f9a35a5d4d1d3ba23d7871113cbd3',1,'operator*(const Affine3< T > &affine1, const Affine3< T > &affine2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gae9c102e6fd783bcf801e3432aca22e7b',1,'operator*(const Affine3< T > &affine, const V &vector)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga548eb6a25623179405f13cad3954c01e',1,'operator*(const Affine3f &affine, const Vec3f &vector)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaa607fd3c66c5c525cc4d39dc83ffd177',1,'operator*(const Affine3d &affine, const Vec3d &vector)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab2ccc99b90013df8b9cf49f6c63842ff',1,'operator*(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac2116f5bce2914d578953c6ac8c0da16',1,'operator*(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga902a09c161f9ef0eedcf1414e58f3672',1,'operator*(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487b453f9836d06d7324744d40dad0b',1,'operator*(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6515905db0f226f4645878f458e4ff9',1,'operator*(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf583d2c1fcd51d86094e1f30b2a58a2',1,'operator*(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e1bad5a79815eec73d07827b885d1cd',1,'operator*(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f79b898d0d82738072b4c49ef4086',1,'operator*(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5a0a9a53dee95c42e80578e6440b218',1,'operator*(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf27cecd7f8e200f4de479660583a8d15',1,'operator*(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7f8cfe1eaafe131a814ee152b9a6e5a',1,'operator*(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12aeb64e97cdb928290bf3fa82f05269',1,'operator*(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fa7f2aa7dd5048da167a76587a44028',1,'operator*(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93118d92ecb3c188a5c01ba769ba299e',1,'operator*(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1a615302d17eda49ad2cec76c41859',1,'operator*(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca535315088057b26c801a5705c1483',1,'operator*(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510f2b0f9088282d3d47bf3093a38f78',1,'operator*(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga163edd6ad357b0a6b49d3ad55b84f88c',1,'operator*(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c75809716911fce2e047b0fb0c984b',1,'operator*(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9db0eb6fb6dacf76ef4e8c8c304ddd9c',1,'operator*(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b5811bca4633d9a78a6cae2adfa3dff',1,'operator*(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafda944b16459e9a69661d33e7607fb41',1,'operator*(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c7c955caf1909eb3c94363e1c7d3cb5',1,'operator*(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4aaeb25bb41c3e4d44a51b4930532426',1,'operator*(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43ee6bae7bda7ed2faf47b555790cb71',1,'operator*(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02baabd5114aa4d102ed246afc6ce624',1,'operator*(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga090d742c550d7e79878be81be9bdb2d2',1,'operator*(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18a1ba838a8be508e64a43158cc45dfb',1,'operator*(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e14d050010ca7c994471bf8467e32d3',1,'operator*(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d7b1523f9c29c8a05ad2e41f191a2fe',1,'operator*(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa1246b30b73eb70bba00a86fcd66395',1,'operator*(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba88bd93ccad1c92db994fe051e342b',1,'operator*(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98f94ba39b97b682e67464d85209e95',1,'operator*(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84372ff1d3b6a2526b19964595096039',1,'operator*(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3cc2c07d0405e5bef08000f75eb39e8',1,'operator*(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c697c1a0f04f6e63a5f9da4ac327e85',1,'operator*(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc87fb00c079b8edcfccd10ab13af8d2',1,'operator*(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf59a024579c49c38a26a8a27e58297c1',1,'operator*(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf912af0788d82a8d5aff820aaa99059',1,'operator*(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88c3308c7efb95649564d8be2691284d',1,'operator*(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb953af5f4125ba0182c6f8917300f90',1,'operator*(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac65246dd4280d78429ab84b3fc9c2870',1,'operator*(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f3e6aea5eb84905c559ef24412fa56',1,'operator*(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga414e54087adc42f28fa754230dbab979',1,'operator*(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac2d56a48c008a7e47b6310b109b376e',1,'operator*(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d7b82717c159efcaadead58ee8142a8',1,'operator*(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe5bfda78209600b7280b4bbd3cc3762',1,'operator*(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae528d51efc3d013a608832c80bed2f8c',1,'operator*(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga849d54a360b19427092bd7ce395da7c5',1,'operator*(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f187e66cff592d0712ceaaa605e038',1,'operator*(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac0afe2a5142d8098d2482c3814f8671',1,'operator*(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5a08e2ac528655b1571f7fcb28c3c0',1,'operator*(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5333891f8e975c6bc4e8f5813545b4b',1,'operator*(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a3078c6a237576551f2d32606e32f10',1,'operator*(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed7245cd9d9405b2de08c4b21fa08a5',1,'operator*(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc381907b598468405b30d25a06c8ff',1,'operator*(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e97c44127431ce49735fa92dbe4b25f',1,'operator*(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9424ca0c0b214254e9adecb61adb2e5a',1,'operator*(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae410ccbe1a6a58649302ccebf3c68949',1,'operator*(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3b2a2d0d9a613d056c8523e155b674c',1,'operator*(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85f5cd22ec760e4a2c14c78d80f4670d',1,'operator*(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37e9268a08593a1e1bb839e2ce50ede9',1,'operator*(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2429e2ed1796030785a93567ecf1776f',1,'operator*(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1c28bd26127b812ce97c907b32fc9fc',1,'operator*(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9cc4a289ee92829765bdf1958bc6e05',1,'operator*(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e8f6dbe9d17cbd6cf04375fc5fca9ae',1,'operator*(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f2fa27b61586fef88ab71db6e08faf0',1,'operator*(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf9988841348e5856a943b777002e2b',1,'operator*(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b8a526c1994b95e9ce76e3614acc86',1,'operator*(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23920ad7c06382a913e3fcf217459a0b',1,'operator*(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e9ba42884866db4b183e9028fd8b04f',1,'operator*(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf5b25603db42e2eb11c8fdd17a7f25f',1,'operator*(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c10d68845ebb0598810e51a2eba805c',1,'operator*(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65f2d1823549a4b6dc52ef6d3054ba56',1,'operator*(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1f3d4142ff834d438ef16a84fb23355',1,'operator*(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fcd3e4a9f5ffcb684e3945e713a190f',1,'operator*(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3caace9001357c38394f006fb1f634a',1,'operator*(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2076958e894ca52570151a2308d8c781',1,'operator*(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2741381920372f76817c4b9b76e28137',1,'operator*(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2394ee2867506f375e14a36018519d8a',1,'operator*(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6028638b717b193d90a9bbdd76a2797',1,'operator*(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf250948634b71efc0820d731faa6cda1',1,'operator*(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc861ca7430feace92266e538ed54b24',1,'operator*(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08650b887f60c9a6c242c79f09c0cb69',1,'operator*(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5522c68d2ae330209abc2765d6b50992',1,'operator*(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacef4b96ed094bbed58d13a7071d1a87a',1,'operator*(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5bd92d93ed5dbf9714a033550a83ed',1,'operator*(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac18603d03fbcfdfd23751709f2238029',1,'operator*(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5afec7fb5b0492668e86c8181f441aa',1,'operator*(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2943f13db2702fddce4557a2e957c565',1,'operator*(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32454c9d98afba5f7144a92cd6bf5acb',1,'operator*(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16a1d022b4026918e85eaf28ac606a81',1,'operator*(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8c6dcb676ea367c9e1dd89fd4f0abf4',1,'operator*(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27de604fa033669bc0555199b31ef777',1,'operator*(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1edec141c59b8a684d2592d1420949a1',1,'operator*(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07a0d9f472b1baec9f5eabfff9d1eaf7',1,'operator*(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6be4a7723c490f8b150c714436100e12',1,'operator*(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddd96b00b4b034d26ce474707a4e5e1d',1,'operator*(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7ef727c5051a2421616f0517740d984',1,'operator*(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11b210a1793cf8e3d930c11dfda9ae6e',1,'operator*(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55db9f51fac5b573deb32220a631ca9',1,'operator*(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28a4888db08301e51da23d006f382653',1,'operator*(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7020c56e082be84fca69fa2c9916a4e',1,'operator*(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c25ca47380b7997200bb81a88f0323',1,'operator*(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7b92c373c28a5c4e44617cbbe8b28d8',1,'operator*(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dff9b27265d9a0d0b246618c2f6d190',1,'operator*(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e7e1c4649f286432072ebf0bbcaa069',1,'operator*(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98148cbe18fa5a1fe9cc37af9b2944da',1,'operator*(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8af39ddbfd14cda64dc1ea8312ddeaab',1,'operator*(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25a1baeb7c9b07639b599dcafb0a7dd1',1,'operator*(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cfca580e4aed7f30b018f5b3b5f04de',1,'operator*(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28a09636e8ddc34502754ef3cc45736',1,'operator*(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd4d86a80e9a8ba4d0b8191946a7c7e4',1,'operator*(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga500f12286f4bde3313357ee9b77522d8',1,'operator*(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b1789f57a51f5db4560fe91f26bbd1',1,'operator*(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5723f7cf916b1c9455c8581abcdeb505',1,'operator*(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0e897f09e26316ca2aa0cbb965e1835',1,'operator*(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga314f5a0e14f5b478c6c979776c26d203',1,'operator*(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819a0d444655998d3ae70cd93b283319',1,'operator*(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a5340751b48d6b199875c361804465',1,'operator*(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bce5ffd4058a6549f3bb651f50bfe46',1,'operator*(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ca0ada3b453db74593720374e9af90f',1,'operator*(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2228f02f69514b9ea9c3bd30df71d0',1,'operator*(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f24178f4139fa88be47e2b9f7126eb',1,'operator*(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82ad067165475e005f75eb902cbcf2f6',1,'operator*(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eca4d9d17555bb68127757943e54495',1,'operator*(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddaa9f9bc413848a741a108556de7f66',1,'operator*(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d937bc5dd036bbbc645b81f260b5b5',1,'operator*(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3cce3391058528e77d01b2f2aaf28f4',1,'operator*(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd32b6bf1571865c29d46f1ac091c5d',1,'operator*(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09b06dc7f40394668ea338909fdb11da',1,'operator*(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2561dcb50f1b343e79d929c85d9d6af2',1,'operator*(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab96739276183d3d037db1b31b54f98cb',1,'operator*(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bc8a2714623a07f6d32a01c5a02a19d',1,'operator*(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e546e55ec80d5ce6e41dd72c8091ad7',1,'operator*(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0f13827bf653baef99ce65166394e7f',1,'operator*(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19620047188467d968634de432862b30',1,'operator*(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9f8c286132b32a1d0d2f136b9304e9f',1,'operator*(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89bebd81801426221358914f44b9399f',1,'operator*(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad909b1577d5bc471b8ebc7d934253736',1,'operator*(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ddea16553b01373469d460fd8f5f9',1,'operator*(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd372b32bcd38be3dd4261d657c742fa',1,'operator*(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e03853be024cf4a58640b575d7b6122',1,'operator*(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b0ea30f8320cf30ca3b42aa699e1d11',1,'operator*(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4976047aad73ae11f14d5311b5efc643',1,'operator*(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d268df51117be47d5a192550113b2bb',1,'operator*(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga886827c0f13b44c8fa578f3d4bab6187',1,'operator*(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06546a623ef3a0292e0d0b5b9a241596',1,'operator*(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f215d83712628eb64664ca8edc729c3',1,'operator*(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322e5725d39b6a56b10217744fd54c84',1,'operator*(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ca17de0407d90a3cac404220b157d5',1,'operator*(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac169dc02de88236dc3287630549e7c32',1,'operator*(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d60d4ea2cc22ce5ae0cf0950b2148dd',1,'operator*(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95b4ecd54e292812be0faf0a93687fa5',1,'operator*(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9246aa07ab9cb8d3a42db71f45d804a',1,'operator*(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed19b40b852d4b05f7af20906f02df96',1,'operator*(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa8c599bd31954a5687b8a1ae2ba1696',1,'operator*(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ea6d03ee2c62f728d3fbfe71f16b259',1,'operator*(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dabe0e00519ed1f069e7682e7dc28d2',1,'operator*(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga916d16970792f1444932d3551460e762',1,'operator*(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0acc20bf74d011ff6eb0263efa31c91',1,'operator*(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacea516a696d7e15b81d71bc335a1be2b',1,'operator*(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67e2f781ad85fbc5b4b2759018ef0bc',1,'operator*(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cee4b43501cb0d54db315a9be3c00be',1,'operator*(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eb8ba99e7883f7e5208da1d56a63ea8',1,'operator*(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd127c751ea3d9b32c47a50503405eaa',1,'operator*(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea8d0ec3ad321a074118524061e9de9b',1,'operator*(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae972a64880e7f11f0b512bf4862c988d',1,'operator*(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae7124c60811e471f4ccea775e6a8105',1,'operator*(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefcfe41bdbb40358a627620664e43087',1,'operator*(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga532206b6078098de41bdb7cdee843242',1,'operator*(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6dde37f01013af843248fa57df5a4705',1,'operator*(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d83c6f1c934d58b0db96fb9b1031e4',1,'operator*(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0555787fcd7d58a8c94d0a4369c947',1,'operator*(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5305d06b4d7893f8d4fb352f6941d49',1,'operator*(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbccb0f7cfedd9faa5375d17e7acd9e6',1,'operator*(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d713228fed5e4b46d913ee514c4702',1,'operator*(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga416c75338bba0071cde9be85bdd14c8f',1,'operator*(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c4bf653481daa71869c6ec80f7ac7c',1,'operator*(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62bf09c0d8b2a28f9de71abb998ab55f',1,'operator*(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e873b6129892d4d634e0b541aa5a356',1,'operator*(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db9280a8455e340346203f8c8dbc45d',1,'operator*(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bfdc89f82d9717003387c1d237f5923',1,'operator*(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f86fba4880a36b6a7bd2394e161b34',1,'operator*(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f952a21290dc2760de145e020239a6',1,'operator*(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga530e3a25447a5113790059cf574c9d4d',1,'operator*(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga939ac4107ae2ef44cdba119f11a3e41b',1,'operator*(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa226675e3d5fa565377951e1fe2adf26',1,'operator*(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga032a606b459e22962751c5b5cb56721c',1,'operator*(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42182588882947c6d2ea60418ccfa53f',1,'operator*(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657fd69c2c2dbaa5bbd8f38e9086600c',1,'operator*(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga913025bdda9cfaf0a1d39fe6f912d32e',1,'operator*(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcfcf7d4b858ae3c794028e7c55b20a',1,'operator*(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b854a847e119bfbc02c2cc5de31787',1,'operator*(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb615b962e904782d9555a089708366d',1,'operator*(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b093cf980d6cabad1afbc4954ce86f9',1,'operator*(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0613453550f4199c8fe8734f2e7ef4cb',1,'operator*(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb4e9c2226edb173d19a520c69297f57',1,'operator*(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a441729d11f327aa925f6980920c810',1,'operator*(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c93c9c99656ffb2dcd5abda39efae1d',1,'operator*(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b2fee3c015fbd9323b9951b595639f0',1,'operator*(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1881d24ddb09d043dcd7c859e61b16',1,'operator*(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c0fa10b8bed67d42ab55dc2208107f8',1,'operator*(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga027915df6e568365ecfa3e12a5e677f4',1,'operator*(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58bcfcef533a71a0a1a9ee50738d257c',1,'operator*(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5920528b65944ed40e4497447d8e0316',1,'operator*(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44418d16b815d5057b17b2a34246734c',1,'operator*(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d29745317c743241a4d85cedc91bf88',1,'operator*(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cbf71951b93eea0b5a076f7d18a7451',1,'operator*(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e048d5a2db1da9b1575aebd01b047bb',1,'operator*(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga663d40c6e2002f25c436d52d82b2c690',1,'operator*(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7bd29f68c70d0a3b1b705f889140d0e',1,'operator*(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4030fb67021c4472688f397dc551adb',1,'operator*(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3476d190ac862ed33f50e5178938f6a',1,'operator*(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04af26fcf72bcf1ea89a3406eb81dc56',1,'operator*(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01861575c1321bb4e37ba4ff91b8f7dc',1,'operator*(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9601e46278afcfaa677985f801a57d76',1,'operator*(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab805b6e07f01115a8e08afa3108525',1,'operator*(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a3751f548f681546118362181963dae',1,'operator*(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8075bb13162203e07a2b9276b42aa063',1,'operator*(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f7ee241d6ee1a6a20c735286770c6f',1,'operator*(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga789c8bfcf46261d2c0c69901bfc53c61',1,'operator*(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33a577374fa11cf0c7d9debceed5d70b',1,'operator*(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab14d1e659db18b0c671ca9dbf9e0048f',1,'operator*(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfad4cd4b1abf7ed115e9261d4fafaf1',1,'operator*(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95434e47c47ea25a3a6d9f1906258286',1,'operator*(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66aff7a10720233331180655c8be700d',1,'operator*(double s, const double4 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga198533c477a87a54b78d348778d6a246',1,'std::operator*(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gadcae3a7fb5244e221cbab5efb79b56c4',1,'std::operator*(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga410ff39982a7970454bfe8e1ce7ddcf7',1,'std::operator*(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga198533c477a87a54b78d348778d6a246',1,'operator*(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gadcae3a7fb5244e221cbab5efb79b56c4',1,'operator*(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga410ff39982a7970454bfe8e1ce7ddcf7',1,'operator*(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad225313de8037d40c2d26c17edf1a9fd',1,'Eigen::operator*(const InverseImpl< PermutationType, PermutationStorage > &tperm, const SparseMatrixBase< SparseDerived > &matrix)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a9723b3ff0f2c99fe1081e3eb14380d4c',1,'Eigen::operator*(const MatrixBase< MatrixDerived > &matrix, const PermutationBase< PermutationDerived > &permutation)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a06ca1e6b1a30b4dd0f2633664fe4d956',1,'Eigen::operator*(const MatrixBase< MatrixDerived > &matrix, const TranspositionsBase< TranspositionsDerived > &transpositions)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a634bfd5e206a2e77f799b4c3956ea49e',1,'Eigen::operator*(const MatrixBase< OtherDerived > &other, const HouseholderSequence< VectorsType, CoeffsType, Side > &h)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a02fbb1bbd915b899b34a56a3cd64c438',1,'Eigen::operator*(const PermutationBase< PermDerived > &perm, const SparseMatrixBase< SparseDerived > &matrix)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a4d2abe28092f8070e971494c7e0b507a',1,'Eigen::operator*(const PermutationBase< PermutationDerived > &permutation, const MatrixBase< MatrixDerived > &matrix)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a8b7051d2f98498d619044089949f931d',1,'Eigen::operator*(const SparseMatrixBase< SparseDerived > &matrix, const InverseImpl< PermutationType, PermutationStorage > &tperm)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a429958a0e6bd27168f3935d3100c55cf',1,'Eigen::operator*(const SparseMatrixBase< SparseDerived > &matrix, const PermutationBase< PermDerived > &perm)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a02b783ce2d2464d4f4a0bc0d1dc494f0',1,'Eigen::operator*(const TranspositionsBase< TranspositionsDerived > &transpositions, const MatrixBase< MatrixDerived > &matrix)']]], + ['operator_2a_3d_312',['operator*=',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadfb86357bfb8cd27685582d3b7bb49ab',1,'cv::softdouble::operator*=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga412ec9d48b6f525b0ca44cfe4a2f12f9',1,'cv::softfloat::operator*=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'cv::Vec::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'cv::Vec::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 2 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 2 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 3 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 3 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 4 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 4 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 2 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 2 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 3 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 3 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga7bb2f4f7a2db97ebfa07181ba6435d1a',1,'std::complex::operator*=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaa495c7cb0718149e6a34650bc5ec4e1',1,'std::complex::operator*=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga84520c24cc0701e3f2bbeaea755e4aa2',1,'std::gslice_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac530f41a625a6f0842fc4fda0cb98189',1,'std::indirect_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga1878d8ab7ea54a42bbd783172af8a8c2',1,'std::mask_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2ae66c8e0229b65881780cb0dbd55ef8',1,'std::slice_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga345cd13171b5d52efb4979a1b3930ea6',1,'std::valarray::operator*=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab5a419c3673c284962634894e9c1fc20',1,'std::valarray::operator*=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga345cd13171b5d52efb4979a1b3930ea6',1,'valarray< size_t >::operator*=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab5a419c3673c284962634894e9c1fc20',1,'valarray< size_t >::operator*=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a6a5ff80e9d85106a1c9958219961c21d',1,'Eigen::ArrayBase::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a6a5ff80e9d85106a1c9958219961c21d',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3783b6168995ca117a1c19fea3630ac4',1,'Eigen::MatrixBase::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3783b6168995ca117a1c19fea3630ac4',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3783b6168995ca117a1c19fea3630ac4',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'Eigen::QuaternionBase::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a84fd39c79d4ca547ef0ff6c3c1dfcfcb',1,'Eigen::Rotation2D::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#adb13b29d664962dc3f62551644f11e87',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'Eigen::VectorwiseOp::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Derived, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Derived, Vertical >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator*=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gae3a0bf0a7afa1dd2d3f4390220fd0934',1,'cv::operator*=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga412ec9d48b6f525b0ca44cfe4a2f12f9',1,'operator*=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadfb86357bfb8cd27685582d3b7bb49ab',1,'operator*=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gae3a0bf0a7afa1dd2d3f4390220fd0934',1,'operator*=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga7bb2f4f7a2db97ebfa07181ba6435d1a',1,'operator*=(const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaa495c7cb0718149e6a34650bc5ec4e1',1,'operator*=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga84520c24cc0701e3f2bbeaea755e4aa2',1,'operator*=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga345cd13171b5d52efb4979a1b3930ea6',1,'operator*=(const _Tp &)(Global Namespace)']]], + ['operator_2b_313',['operator+',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a366cabf9cd5b9a9fb0e313570c5b3cac',1,'cv::MatExpr::operator+(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a93d7d34c3f0b5dbc5d6171d0a0094f28',1,'cv::MatExpr::operator+(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aefc08124af851c90433c85f39fb63a7e',1,'cv::MatExpr::operator+(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a503c5fe1e1f66590b35969fc28ba1af7',1,'cv::MatExpr::operator+(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab866e1c69c03008f2f9c0d923c4dc861',1,'cv::MatExpr::operator+(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a65604e00ecb411bef65e3c668a4bdf63',1,'cv::MatExpr::operator+(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac9b4c182fe91d94500d290beb8098345',1,'cv::MatExpr::operator+(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4f77f0a2048840246c7f219c5a06f2ff',1,'cv::MatExpr::operator+(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5d74e36027bfe69b2a50c7d5cc53752b',1,'cv::MatExpr::operator+(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9694cf1e4e9fe627f8b701cb9f97f2d0',1,'cv::MatExpr::operator+(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a366cabf9cd5b9a9fb0e313570c5b3cac',1,'cv::MatExpr::operator+(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a93d7d34c3f0b5dbc5d6171d0a0094f28',1,'cv::MatExpr::operator+(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aefc08124af851c90433c85f39fb63a7e',1,'cv::MatExpr::operator+(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a503c5fe1e1f66590b35969fc28ba1af7',1,'cv::MatExpr::operator+(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab866e1c69c03008f2f9c0d923c4dc861',1,'cv::MatExpr::operator+(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a65604e00ecb411bef65e3c668a4bdf63',1,'cv::MatExpr::operator+(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac9b4c182fe91d94500d290beb8098345',1,'cv::MatExpr::operator+(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4f77f0a2048840246c7f219c5a06f2ff',1,'cv::MatExpr::operator+(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5d74e36027bfe69b2a50c7d5cc53752b',1,'cv::MatExpr::operator+(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9694cf1e4e9fe627f8b701cb9f97f2d0',1,'cv::MatExpr::operator+(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'cv::Matx::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'cv::Matx::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< _Tp, cn, 1 >::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< _Tp, cn, 1 >::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 1, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 1, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 2 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 2 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 4, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 4, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, cn, 1 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, cn, 1 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 2, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 2, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 3, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 3, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, cn, 1 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, cn, 1 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float_type, 4, 4 >::operator+(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float_type, 4, 4 >::operator+(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gacf49831e844a094b21a41a37df2189e8',1,'cv::softdouble::operator+()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadb3c3fbb5bf49638bcaeddbfd16f3df7',1,'cv::softfloat::operator+()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'cv::Vec::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'cv::Vec::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< _Tp, 4 >::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< _Tp, 4 >::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 2 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 2 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 3 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 3 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 4 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 4 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 2 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 2 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 3 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 3 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a6719627d8f502c54e16f321d1790e030',1,'std::fpos::operator+()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a936c0491dbd3dfadfdbee626478b7009',1,'std::reverse_iterator::operator+()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga33a3a90827549220500c99f95b095816',1,'std::valarray::operator+()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga33a3a90827549220500c99f95b095816',1,'valarray< size_t >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'Eigen::VectorwiseOp::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Derived, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Derived, Vertical >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator+()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga9d4eb51e74c435420686e52b53d915a0',1,'cv::operator+()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga385a1836312404fd848a8f74b8ad7864',1,'cv::cudev::operator+(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0564f5e1dc7986e8b367e5e18d628cf9',1,'cv::cudev::operator+(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5751f0f9eea09af7d7be1a7ff9a6419',1,'cv::cudev::operator+(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4926bad3815b360be75781d8f789a299',1,'cv::cudev::operator+(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487522cfe2377387f941eb27b11052f0',1,'cv::cudev::operator+(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5318bd8d2d748d2c2f2e85cfa83f4174',1,'cv::cudev::operator+(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a593b2d7e5a664703a3189cfa3e8a2b',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga401671318958313b03cab9656be10333',1,'cv::cudev::operator+(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34588ecb09ba0f5b8bce1932b71ac2dc',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab32742b4d82dacbf5b03c3caaa21ad6a',1,'cv::cudev::operator+(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb808a69e62713677618f7e6aa6bad1c',1,'cv::cudev::operator+(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e85ea3a9090037ad78ba58f8d0635d1',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa545ec34a0a8d0b6b566d40d6b06be4',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88558d974e34b06012625b059582f84f',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ef3164d983c6c208fa7eae2d04e4901',1,'cv::cudev::operator+(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00e830af93185b0b0d9254abb4a3ba25',1,'cv::cudev::operator+(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga360059063d9c94f6895ad04c5538caa2',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab09d02dd9ae9cba4fff849e8cb4f011b',1,'cv::cudev::operator+(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaee9d8126772df36af785513ee3f33a0',1,'cv::cudev::operator+(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7809d9f6135f58240496734783a0d8e7',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa48ac783fc4d8c222edc3a5fee93d08',1,'cv::cudev::operator+(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1413eaa25988525f32e8b0c38588aca4',1,'cv::cudev::operator+(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31142062b4480b36487e1ceaf5001c60',1,'cv::cudev::operator+(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657e5172dce9285cd3450207c231ba91',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c965673b83d820595742fcba9d84ae6',1,'cv::cudev::operator+(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c140fc976d1e3b806105fbc841c5c8b',1,'cv::cudev::operator+(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87375c057e8e240da0620c8d30375fae',1,'cv::cudev::operator+(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f396374a8c6eaab38c438aa19f61953',1,'cv::cudev::operator+(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafadeec24b1b0d32d74f4bf66913a4961',1,'cv::cudev::operator+(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4626d73f4a41498ea009b0405b6fc58',1,'cv::cudev::operator+(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafec18ef79d72a4abcb395b55fa950ecc',1,'cv::cudev::operator+(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd70100577469c4b17877014098c321c',1,'cv::cudev::operator+(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga070cddd435b54d39dd9f53202de91e70',1,'cv::cudev::operator+(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65c78b19985aebe50cff55cb91091cb5',1,'cv::cudev::operator+(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a8be678d5c6d59577d013b1bc0f659a',1,'cv::cudev::operator+(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad505ddfe2b0b2efd85712ee4ee151ee',1,'cv::cudev::operator+(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa716696f351b72ed62b2eb9298e92431',1,'cv::cudev::operator+(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24687bb3a3f43d4cf77051b7f61c5bb5',1,'cv::cudev::operator+(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286f2da548b65f5e52a36f3a0c1b6e72',1,'cv::cudev::operator+(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e7d1a9a90ccd15a67db5330d206d39',1,'cv::cudev::operator+(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdc537c7585647e3c6244b9ff20a0f8c',1,'cv::cudev::operator+(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ad4f702de359a5fc1a9ae0f7e8a675b',1,'cv::cudev::operator+(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac437623c5a924fb1f5ec76555bd9349c',1,'cv::cudev::operator+(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09c0474800254c2fe5df7078b22f0c4',1,'cv::cudev::operator+(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5f3e910fc0bfac66f7b492dfaffa89d',1,'cv::cudev::operator+(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc384f8555e474bf0b42ba3294efbbe',1,'cv::cudev::operator+(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga230f38bc05d616d730d39e284de2a572',1,'cv::cudev::operator+(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ea72be29807fa7a5e3e125bb28ae1da',1,'cv::cudev::operator+(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095e7b638083196b19aa23f0fefb7f8',1,'cv::cudev::operator+(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbbd16fd0445cc803b551cefccee7d84',1,'cv::cudev::operator+(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a507070ee180987e572c027ad63720',1,'cv::cudev::operator+(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c8c57cb603e887926b3ef02d1b1f60f',1,'cv::cudev::operator+(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga751771b8771fc49355177eec0a0c7d11',1,'cv::cudev::operator+(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38a48c26d465ac5004500358a3be3fce',1,'cv::cudev::operator+(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e50479d44fef2f0af1d8bde6e6be5ad',1,'cv::cudev::operator+(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d63e7a7da37c059ee00217e3ab7e4f5',1,'cv::cudev::operator+(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a5a7ffefbe42e9de70da5fa44e0ea4',1,'cv::cudev::operator+(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69524132efa29c8fc980d6064a5c4fe1',1,'cv::cudev::operator+(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84f6e2fa384a11c09c186bf90f942305',1,'cv::cudev::operator+(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9634185808bd5543bffebed158218603',1,'cv::cudev::operator+(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a6f9277eb1d9b4ad95fb976f74be75',1,'cv::cudev::operator+(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1603e29ec853a1114e2fb0815a51ea14',1,'cv::cudev::operator+(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0f4f24948f8a31dd58c7504e95ae',1,'cv::cudev::operator+(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97fa01c350fde8c17cf70e4a665b42b6',1,'cv::cudev::operator+(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fafcdc8062ddf5b9a78cae00c698bec',1,'cv::cudev::operator+(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1fd6fc4c1d59c4d53aa036558028249',1,'cv::cudev::operator+(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd40aac024e1bcaf8023c2e35ced21c1',1,'cv::cudev::operator+(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695049876ddf039f3165e81de036bedf',1,'cv::cudev::operator+(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b80304249a375b80a8ecc267010063c',1,'cv::cudev::operator+(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa15da58a45f9288fb35d6f8804d748c9',1,'cv::cudev::operator+(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2dc62a33db896daaa413d6ea63511cb',1,'cv::cudev::operator+(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d432caa595a9d4e640a86c17dc87b33',1,'cv::cudev::operator+(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecb6ed173735a3e47a133011930bf170',1,'cv::cudev::operator+(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e20dbff7f2045ab3c4be9470646731',1,'cv::cudev::operator+(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89417add04bd126c8f349fc38e0be984',1,'cv::cudev::operator+(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f625b502a1cce9022de0c517a258989',1,'cv::cudev::operator+(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c24ef33bcb0428c76d9000d0c2dda7',1,'cv::cudev::operator+(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b2125e71b80c7fbed85a25428e4c3ce',1,'cv::cudev::operator+(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf25af14c9fafc45956d1531db11144ec',1,'cv::cudev::operator+(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e4c43d9bd3c9baf188b342a11cb6c92',1,'cv::cudev::operator+(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbe87e48c185c1c553f1781c8e51a78b',1,'cv::cudev::operator+(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a9afd18666cabaaff2b5bc1c6953c3d',1,'cv::cudev::operator+(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d6cd004ebf0046d8d05ce58be122e81',1,'cv::cudev::operator+(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf1559bb0b4711ff843e1f8689b0a21b',1,'cv::cudev::operator+(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9722a56f762fd4695dba0a6f581f993a',1,'cv::cudev::operator+(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf855f9f25f4366fe40e26fe92a193707',1,'cv::cudev::operator+(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadedbaa5bcb6aa88fcbbb08af9a056f23',1,'cv::cudev::operator+(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d7795a199307f39f05a7a52b7de164',1,'cv::cudev::operator+(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga491957d2d9dfc406352ab6f9e8c1483e',1,'cv::cudev::operator+(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac82a73e58ad54a045e3d6f90d4f00e91',1,'cv::cudev::operator+(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5509c565962e42b79b574ad682fd5044',1,'cv::cudev::operator+(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27dfa9b51f3a3aef1cbb1e874a1ebb17',1,'cv::cudev::operator+(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd8c880d85625a11bbbe05dea82e01ef',1,'cv::cudev::operator+(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc977b3f2a65f34876a461d9f8518a0f',1,'cv::cudev::operator+(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9be7290ae6342d75ea634d0b164f1ff9',1,'cv::cudev::operator+(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c8f90f6f825fb29b485ffe50390bf9a',1,'cv::cudev::operator+(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0244726591afd293c8228ce596639a63',1,'cv::cudev::operator+(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b851bb2cf578a6c6fe7ef7f02231fa3',1,'cv::cudev::operator+(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac08b7d9bbd26916b5650d4c95cedfdf1',1,'cv::cudev::operator+(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga617aa0c6e7b5bab86edfba469189b518',1,'cv::cudev::operator+(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c8b32a9eb67e145f7e8e6a4f58ee446',1,'cv::cudev::operator+(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa78824f70ed6aff53a468ba69721b940',1,'cv::cudev::operator+(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133f66972b269764ee2ee346366e86f8',1,'cv::cudev::operator+(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf1feb32c0186aa799348a619b15d492',1,'cv::cudev::operator+(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd42be9af8cc02f9ef351bbfead86e9',1,'cv::cudev::operator+(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac578dbae14068cab12ed2474c3d4c26c',1,'cv::cudev::operator+(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaead47ecf6a982cd89d2bd0e641b3b7de',1,'cv::cudev::operator+(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad410367422b6d4613cd9b3267ba698ad',1,'cv::cudev::operator+(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec447276ee554fbeadb63b05ad85816d',1,'cv::cudev::operator+(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac50f4daaf1949b1ef02de731dd4ddf65',1,'cv::cudev::operator+(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bde0cbb5805451c231fdad81908f849',1,'cv::cudev::operator+(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3085b3839365b0059cf1d31f19a63e3b',1,'cv::cudev::operator+(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55869a964cfdd901e7f67148a2e7d39',1,'cv::cudev::operator+(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbe668aec66b824c71e9cedb3e81b476',1,'cv::cudev::operator+(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c65960614e3da3a1c84780c344fff3',1,'cv::cudev::operator+(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f012e7f890a1d981c451c061b18da4f',1,'cv::cudev::operator+(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5bc69c6f65a3267d86c10e9427e50b3',1,'cv::cudev::operator+(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32eb280bd3436219f82bd7749046ce95',1,'cv::cudev::operator+(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa38542588a556bd21f1a3965b23d8d7e',1,'cv::cudev::operator+(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d06cbe3afb88ccc14d64cfa586ebfd',1,'cv::cudev::operator+(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e2e78e19bf1e54a3e764c47de16439',1,'cv::cudev::operator+(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga705b07f251d4e2c6a1d387e47fb0ebbf',1,'cv::cudev::operator+(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ef44a2d91c634e28cb3b493e1f6c9e9',1,'cv::cudev::operator+(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c7ee9b5737344bec6da2ffa4e0131b9',1,'cv::cudev::operator+(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61a7a96d326eace5a635e011cb2c76de',1,'cv::cudev::operator+(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8e25981380ec4e29c96d742e16f4caf',1,'cv::cudev::operator+(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69182858edbcfc754983f725faed9caf',1,'cv::cudev::operator+(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58a0aa4ac62f9368f026cc9cae4ab27c',1,'cv::cudev::operator+(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4932125e3fb3d43e988f20d98c92088a',1,'cv::cudev::operator+(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80481ef157cd534a7917db2c17806e11',1,'cv::cudev::operator+(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1945ac3f9acb340d56b2a123b56e2b6',1,'cv::cudev::operator+(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cda29304020b62ea1023d4c78357da9',1,'cv::cudev::operator+(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3890c98225ce81b7a9563dcadcbaa726',1,'cv::cudev::operator+(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2729c40733ac42bc9d8e8f22515d280b',1,'cv::cudev::operator+(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga815dd0dd7f2c53d35d474093f4f280a5',1,'cv::cudev::operator+(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f87c194094f4b225e01acc41ab4794c',1,'cv::cudev::operator+(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2935ebf4613c634864ae4604a27887ac',1,'cv::cudev::operator+(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cf666905454d84b149ae1f48d67bcc7',1,'cv::cudev::operator+(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedaaa885c3e387fcd8a57556223aa7a6',1,'cv::cudev::operator+(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab897af788ef49fe0a09832df944d61df',1,'cv::cudev::operator+(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b4ee5d82e458102eeab773243ea035',1,'cv::cudev::operator+(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5661c7cb9979d6cc95e98a6b324f3027',1,'cv::cudev::operator+(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga215e0e32a513cc0a9d870aa2af9f8563',1,'cv::cudev::operator+(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66d278c2d4206520854c7bf1ccfe0f71',1,'cv::cudev::operator+(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22d7acef9c458758b9938b5c16ecf1a6',1,'cv::cudev::operator+(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c186b379a335e9c0934a7558d7ab6f',1,'cv::cudev::operator+(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa575be0a6a9b80ba0400783ee96172ff',1,'cv::cudev::operator+(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04e953ca224c70e9a2b72a2b32f2cbfd',1,'cv::cudev::operator+(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e63aa7508890f5fc5fe74de963be45',1,'cv::cudev::operator+(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b64430c28f9c83e524066f22576c72c',1,'cv::cudev::operator+(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2807cdcc4a5d60ad709603abceac15',1,'cv::cudev::operator+(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6843246a6684565e67ed25c20c26b274',1,'cv::cudev::operator+(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0d509dbc5cc5eca3f74d25bf58dc55f',1,'cv::cudev::operator+(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac178c31b30000975ec5f66528b8729cd',1,'cv::cudev::operator+(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd5263d626e5688f4eea2edab7d3181f',1,'cv::cudev::operator+(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101de5c53f41c316a19a38dae5b117fe',1,'cv::cudev::operator+(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf58403ff9e23b6cee2516093cd97591e',1,'cv::cudev::operator+(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa185dbf1eb74efb51f3c5b3df4a9779',1,'cv::cudev::operator+(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1ba272cc5c9a2e39be16e19d70f2b0f',1,'cv::cudev::operator+(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af6b3a5e6fae8011628bcba8f730fe6',1,'cv::cudev::operator+(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bea5e892ad256972784f4f242e238a6',1,'cv::cudev::operator+(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34e88270476eaec6947195ac65632fb3',1,'cv::cudev::operator+(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc25f8350d7b49e877a5056c01b0d3a',1,'cv::cudev::operator+(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49bb3b73cfc2d3814000189184c152e7',1,'cv::cudev::operator+(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b58436ecb19bfa8164de7f990262b3c',1,'cv::cudev::operator+(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2032e800d832a8073d0dc2faef8a2dcd',1,'cv::cudev::operator+(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cef590a05e646cd57f77e6ee0be2d54',1,'cv::cudev::operator+(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb7eb522b0b7eb2799e015cfa8b74f53',1,'cv::cudev::operator+(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2af58cde3e25ca7ac04bcf1f55b52b52',1,'cv::cudev::operator+(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9317db3a8d728e6cfa073f4d57f21451',1,'cv::cudev::operator+(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22fdf93a0c8baf015b0d4b3b2cae8647',1,'cv::cudev::operator+(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b86c6d7c58b0794918765f9c1b839b',1,'cv::cudev::operator+(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eb912d94c68c7c592a8abd305d70aa1',1,'cv::cudev::operator+(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0188cf93b31b6d645c8f34f3992acde',1,'cv::cudev::operator+(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa95c038dfcd6f3375fd02c768ad735',1,'cv::cudev::operator+(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72cbd50d5d37be4e5174a68c21197617',1,'cv::cudev::operator+(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb87110c2951164d19f445969b076e96',1,'cv::cudev::operator+(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3e30731dbc17b3371d8017ccecd7d8b',1,'cv::cudev::operator+(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee5ba2d0674493e83ef9f46c19d01780',1,'cv::cudev::operator+(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab720a95ea55112441355a03963e8cb33',1,'cv::cudev::operator+(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03459898b7324f26de2388149ab4405',1,'cv::cudev::operator+(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c6f1db356d455ca3a7f71e81b43c6cb',1,'cv::cudev::operator+(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b4fd2d02f582f3f5c3071a157733fef',1,'cv::cudev::operator+(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73ac7a1964fb9064b94b7000ae14b06c',1,'cv::cudev::operator+(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c37d85d76f27f899a71677bf2c87965',1,'cv::cudev::operator+(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad67577fc0a303c66c31bb1cf11f072f4',1,'cv::cudev::operator+(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga463d44e45ae112517e69b59e5c05d2a2',1,'cv::cudev::operator+(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d45696a36817a7e03096ccb93efd678',1,'cv::cudev::operator+(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab881ab61562effcbdfb223834615cf9b',1,'cv::cudev::operator+(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845975ac0aa7a6e6ebcc6a0a5ccd1c6d',1,'cv::cudev::operator+(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ba4d696f23852287e920f9e39edbbc',1,'cv::cudev::operator+(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32199ebd017e38ef320461f564645fb1',1,'cv::cudev::operator+(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a277011ea76600e79758badd705b678',1,'cv::cudev::operator+(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab43588987ff4b565dff1496dcd93ceae',1,'cv::cudev::operator+(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4152033d3851f97c38b771e239265f04',1,'cv::cudev::operator+(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d988af531245304baa08913efeb0640',1,'cv::cudev::operator+(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10081f4c12a23d7b318423b00c0db522',1,'cv::cudev::operator+(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247ce351637b9c0b52f4915a7d2c4f6b',1,'cv::cudev::operator+(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a268a36253f07ca021dcebfee47ad10',1,'cv::cudev::operator+(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bbe87b038e1f5206c9d675104f91641',1,'cv::cudev::operator+(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab21b3162568bd7ae01f795a239f30ae5',1,'cv::cudev::operator+(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f3015dbf9a8bfebccee4ff5f8f0a13',1,'cv::cudev::operator+(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15d13e591d5ee6826542214b0b74046d',1,'cv::cudev::operator+(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e4033519a3535d8a458fb00ebee1559',1,'cv::cudev::operator+(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931953ada1dffe875beabe1f8f7bd030',1,'cv::cudev::operator+(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f610a053e45fa3c16c26b8fdac93563',1,'cv::cudev::operator+(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ff42a78160f10c832b89c2a7164e9ed',1,'cv::cudev::operator+(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c92678779773f7e36cbb585aff566f',1,'cv::cudev::operator+(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22ace1eefc87813ef769f102b0b3769d',1,'cv::cudev::operator+(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4814b6e72f311d414e0850c0b06ff2c8',1,'cv::cudev::operator+(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b9b43b4642e35d27d7ac6daaae1cf1a',1,'cv::cudev::operator+(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfe6d281caa0fcb744e38d8bca4c8d10',1,'cv::cudev::operator+(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb868810dbd9f370826a464fbfd6b63a',1,'cv::cudev::operator+(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafca4bacae455e2b15d9120d3495dd896',1,'cv::cudev::operator+(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc478dda6bd01bc954b9c52305187699',1,'cv::cudev::operator+(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf711eec1f4565f53cc5b24ffb4a65913',1,'cv::cudev::operator+(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4a1f5111573c3bd3ecfd696a6de505',1,'cv::cudev::operator+(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c4d7c3df7d674b9ff59c463173a1af5',1,'cv::cudev::operator+(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b48c6860baafe07388ea2d096ea63a8',1,'cv::cudev::operator+(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81619ea66499b085d6230361d755efd1',1,'cv::cudev::operator+(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4abcffbca6e6949ee898f486b7e74862',1,'cv::cudev::operator+(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f85134d8553add116bd4111d710dfe6',1,'cv::cudev::operator+(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a5b0f36ca97b7681786abe433e95225',1,'cv::cudev::operator+(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bca16e176bdf04054bf50edd8434825',1,'cv::cudev::operator+(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadb3c3fbb5bf49638bcaeddbfd16f3df7',1,'operator+(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gacf49831e844a094b21a41a37df2189e8',1,'operator+(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga9d4eb51e74c435420686e52b53d915a0',1,'operator+(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga385a1836312404fd848a8f74b8ad7864',1,'operator+(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0564f5e1dc7986e8b367e5e18d628cf9',1,'operator+(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5751f0f9eea09af7d7be1a7ff9a6419',1,'operator+(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4926bad3815b360be75781d8f789a299',1,'operator+(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487522cfe2377387f941eb27b11052f0',1,'operator+(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5318bd8d2d748d2c2f2e85cfa83f4174',1,'operator+(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a593b2d7e5a664703a3189cfa3e8a2b',1,'operator+(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga401671318958313b03cab9656be10333',1,'operator+(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34588ecb09ba0f5b8bce1932b71ac2dc',1,'operator+(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab32742b4d82dacbf5b03c3caaa21ad6a',1,'operator+(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb808a69e62713677618f7e6aa6bad1c',1,'operator+(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e85ea3a9090037ad78ba58f8d0635d1',1,'operator+(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa545ec34a0a8d0b6b566d40d6b06be4',1,'operator+(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88558d974e34b06012625b059582f84f',1,'operator+(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ef3164d983c6c208fa7eae2d04e4901',1,'operator+(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00e830af93185b0b0d9254abb4a3ba25',1,'operator+(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga360059063d9c94f6895ad04c5538caa2',1,'operator+(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab09d02dd9ae9cba4fff849e8cb4f011b',1,'operator+(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaee9d8126772df36af785513ee3f33a0',1,'operator+(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7809d9f6135f58240496734783a0d8e7',1,'operator+(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa48ac783fc4d8c222edc3a5fee93d08',1,'operator+(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1413eaa25988525f32e8b0c38588aca4',1,'operator+(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31142062b4480b36487e1ceaf5001c60',1,'operator+(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657e5172dce9285cd3450207c231ba91',1,'operator+(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c965673b83d820595742fcba9d84ae6',1,'operator+(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c140fc976d1e3b806105fbc841c5c8b',1,'operator+(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87375c057e8e240da0620c8d30375fae',1,'operator+(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f396374a8c6eaab38c438aa19f61953',1,'operator+(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafadeec24b1b0d32d74f4bf66913a4961',1,'operator+(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4626d73f4a41498ea009b0405b6fc58',1,'operator+(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafec18ef79d72a4abcb395b55fa950ecc',1,'operator+(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd70100577469c4b17877014098c321c',1,'operator+(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga070cddd435b54d39dd9f53202de91e70',1,'operator+(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65c78b19985aebe50cff55cb91091cb5',1,'operator+(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a8be678d5c6d59577d013b1bc0f659a',1,'operator+(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad505ddfe2b0b2efd85712ee4ee151ee',1,'operator+(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa716696f351b72ed62b2eb9298e92431',1,'operator+(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24687bb3a3f43d4cf77051b7f61c5bb5',1,'operator+(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286f2da548b65f5e52a36f3a0c1b6e72',1,'operator+(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e7d1a9a90ccd15a67db5330d206d39',1,'operator+(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdc537c7585647e3c6244b9ff20a0f8c',1,'operator+(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ad4f702de359a5fc1a9ae0f7e8a675b',1,'operator+(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac437623c5a924fb1f5ec76555bd9349c',1,'operator+(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09c0474800254c2fe5df7078b22f0c4',1,'operator+(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5f3e910fc0bfac66f7b492dfaffa89d',1,'operator+(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc384f8555e474bf0b42ba3294efbbe',1,'operator+(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga230f38bc05d616d730d39e284de2a572',1,'operator+(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ea72be29807fa7a5e3e125bb28ae1da',1,'operator+(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095e7b638083196b19aa23f0fefb7f8',1,'operator+(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbbd16fd0445cc803b551cefccee7d84',1,'operator+(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a507070ee180987e572c027ad63720',1,'operator+(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c8c57cb603e887926b3ef02d1b1f60f',1,'operator+(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga751771b8771fc49355177eec0a0c7d11',1,'operator+(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38a48c26d465ac5004500358a3be3fce',1,'operator+(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e50479d44fef2f0af1d8bde6e6be5ad',1,'operator+(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d63e7a7da37c059ee00217e3ab7e4f5',1,'operator+(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a5a7ffefbe42e9de70da5fa44e0ea4',1,'operator+(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69524132efa29c8fc980d6064a5c4fe1',1,'operator+(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84f6e2fa384a11c09c186bf90f942305',1,'operator+(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9634185808bd5543bffebed158218603',1,'operator+(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a6f9277eb1d9b4ad95fb976f74be75',1,'operator+(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1603e29ec853a1114e2fb0815a51ea14',1,'operator+(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0f4f24948f8a31dd58c7504e95ae',1,'operator+(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97fa01c350fde8c17cf70e4a665b42b6',1,'operator+(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fafcdc8062ddf5b9a78cae00c698bec',1,'operator+(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1fd6fc4c1d59c4d53aa036558028249',1,'operator+(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd40aac024e1bcaf8023c2e35ced21c1',1,'operator+(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695049876ddf039f3165e81de036bedf',1,'operator+(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b80304249a375b80a8ecc267010063c',1,'operator+(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa15da58a45f9288fb35d6f8804d748c9',1,'operator+(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2dc62a33db896daaa413d6ea63511cb',1,'operator+(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d432caa595a9d4e640a86c17dc87b33',1,'operator+(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecb6ed173735a3e47a133011930bf170',1,'operator+(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e20dbff7f2045ab3c4be9470646731',1,'operator+(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89417add04bd126c8f349fc38e0be984',1,'operator+(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f625b502a1cce9022de0c517a258989',1,'operator+(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c24ef33bcb0428c76d9000d0c2dda7',1,'operator+(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b2125e71b80c7fbed85a25428e4c3ce',1,'operator+(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf25af14c9fafc45956d1531db11144ec',1,'operator+(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e4c43d9bd3c9baf188b342a11cb6c92',1,'operator+(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbe87e48c185c1c553f1781c8e51a78b',1,'operator+(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a9afd18666cabaaff2b5bc1c6953c3d',1,'operator+(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d6cd004ebf0046d8d05ce58be122e81',1,'operator+(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf1559bb0b4711ff843e1f8689b0a21b',1,'operator+(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9722a56f762fd4695dba0a6f581f993a',1,'operator+(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf855f9f25f4366fe40e26fe92a193707',1,'operator+(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadedbaa5bcb6aa88fcbbb08af9a056f23',1,'operator+(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d7795a199307f39f05a7a52b7de164',1,'operator+(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga491957d2d9dfc406352ab6f9e8c1483e',1,'operator+(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac82a73e58ad54a045e3d6f90d4f00e91',1,'operator+(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5509c565962e42b79b574ad682fd5044',1,'operator+(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27dfa9b51f3a3aef1cbb1e874a1ebb17',1,'operator+(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd8c880d85625a11bbbe05dea82e01ef',1,'operator+(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc977b3f2a65f34876a461d9f8518a0f',1,'operator+(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9be7290ae6342d75ea634d0b164f1ff9',1,'operator+(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c8f90f6f825fb29b485ffe50390bf9a',1,'operator+(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0244726591afd293c8228ce596639a63',1,'operator+(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b851bb2cf578a6c6fe7ef7f02231fa3',1,'operator+(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac08b7d9bbd26916b5650d4c95cedfdf1',1,'operator+(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga617aa0c6e7b5bab86edfba469189b518',1,'operator+(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c8b32a9eb67e145f7e8e6a4f58ee446',1,'operator+(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa78824f70ed6aff53a468ba69721b940',1,'operator+(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133f66972b269764ee2ee346366e86f8',1,'operator+(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf1feb32c0186aa799348a619b15d492',1,'operator+(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd42be9af8cc02f9ef351bbfead86e9',1,'operator+(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac578dbae14068cab12ed2474c3d4c26c',1,'operator+(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaead47ecf6a982cd89d2bd0e641b3b7de',1,'operator+(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad410367422b6d4613cd9b3267ba698ad',1,'operator+(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec447276ee554fbeadb63b05ad85816d',1,'operator+(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac50f4daaf1949b1ef02de731dd4ddf65',1,'operator+(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bde0cbb5805451c231fdad81908f849',1,'operator+(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3085b3839365b0059cf1d31f19a63e3b',1,'operator+(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55869a964cfdd901e7f67148a2e7d39',1,'operator+(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbe668aec66b824c71e9cedb3e81b476',1,'operator+(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c65960614e3da3a1c84780c344fff3',1,'operator+(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f012e7f890a1d981c451c061b18da4f',1,'operator+(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5bc69c6f65a3267d86c10e9427e50b3',1,'operator+(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32eb280bd3436219f82bd7749046ce95',1,'operator+(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa38542588a556bd21f1a3965b23d8d7e',1,'operator+(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d06cbe3afb88ccc14d64cfa586ebfd',1,'operator+(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e2e78e19bf1e54a3e764c47de16439',1,'operator+(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga705b07f251d4e2c6a1d387e47fb0ebbf',1,'operator+(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ef44a2d91c634e28cb3b493e1f6c9e9',1,'operator+(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c7ee9b5737344bec6da2ffa4e0131b9',1,'operator+(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61a7a96d326eace5a635e011cb2c76de',1,'operator+(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8e25981380ec4e29c96d742e16f4caf',1,'operator+(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69182858edbcfc754983f725faed9caf',1,'operator+(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58a0aa4ac62f9368f026cc9cae4ab27c',1,'operator+(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4932125e3fb3d43e988f20d98c92088a',1,'operator+(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80481ef157cd534a7917db2c17806e11',1,'operator+(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1945ac3f9acb340d56b2a123b56e2b6',1,'operator+(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cda29304020b62ea1023d4c78357da9',1,'operator+(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3890c98225ce81b7a9563dcadcbaa726',1,'operator+(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2729c40733ac42bc9d8e8f22515d280b',1,'operator+(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga815dd0dd7f2c53d35d474093f4f280a5',1,'operator+(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f87c194094f4b225e01acc41ab4794c',1,'operator+(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2935ebf4613c634864ae4604a27887ac',1,'operator+(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cf666905454d84b149ae1f48d67bcc7',1,'operator+(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedaaa885c3e387fcd8a57556223aa7a6',1,'operator+(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab897af788ef49fe0a09832df944d61df',1,'operator+(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b4ee5d82e458102eeab773243ea035',1,'operator+(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5661c7cb9979d6cc95e98a6b324f3027',1,'operator+(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga215e0e32a513cc0a9d870aa2af9f8563',1,'operator+(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66d278c2d4206520854c7bf1ccfe0f71',1,'operator+(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22d7acef9c458758b9938b5c16ecf1a6',1,'operator+(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c186b379a335e9c0934a7558d7ab6f',1,'operator+(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa575be0a6a9b80ba0400783ee96172ff',1,'operator+(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04e953ca224c70e9a2b72a2b32f2cbfd',1,'operator+(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e63aa7508890f5fc5fe74de963be45',1,'operator+(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b64430c28f9c83e524066f22576c72c',1,'operator+(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2807cdcc4a5d60ad709603abceac15',1,'operator+(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6843246a6684565e67ed25c20c26b274',1,'operator+(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0d509dbc5cc5eca3f74d25bf58dc55f',1,'operator+(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac178c31b30000975ec5f66528b8729cd',1,'operator+(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd5263d626e5688f4eea2edab7d3181f',1,'operator+(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101de5c53f41c316a19a38dae5b117fe',1,'operator+(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf58403ff9e23b6cee2516093cd97591e',1,'operator+(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa185dbf1eb74efb51f3c5b3df4a9779',1,'operator+(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1ba272cc5c9a2e39be16e19d70f2b0f',1,'operator+(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af6b3a5e6fae8011628bcba8f730fe6',1,'operator+(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bea5e892ad256972784f4f242e238a6',1,'operator+(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34e88270476eaec6947195ac65632fb3',1,'operator+(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc25f8350d7b49e877a5056c01b0d3a',1,'operator+(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49bb3b73cfc2d3814000189184c152e7',1,'operator+(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b58436ecb19bfa8164de7f990262b3c',1,'operator+(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2032e800d832a8073d0dc2faef8a2dcd',1,'operator+(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cef590a05e646cd57f77e6ee0be2d54',1,'operator+(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb7eb522b0b7eb2799e015cfa8b74f53',1,'operator+(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2af58cde3e25ca7ac04bcf1f55b52b52',1,'operator+(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9317db3a8d728e6cfa073f4d57f21451',1,'operator+(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22fdf93a0c8baf015b0d4b3b2cae8647',1,'operator+(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b86c6d7c58b0794918765f9c1b839b',1,'operator+(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eb912d94c68c7c592a8abd305d70aa1',1,'operator+(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0188cf93b31b6d645c8f34f3992acde',1,'operator+(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa95c038dfcd6f3375fd02c768ad735',1,'operator+(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72cbd50d5d37be4e5174a68c21197617',1,'operator+(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb87110c2951164d19f445969b076e96',1,'operator+(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3e30731dbc17b3371d8017ccecd7d8b',1,'operator+(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee5ba2d0674493e83ef9f46c19d01780',1,'operator+(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab720a95ea55112441355a03963e8cb33',1,'operator+(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03459898b7324f26de2388149ab4405',1,'operator+(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c6f1db356d455ca3a7f71e81b43c6cb',1,'operator+(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b4fd2d02f582f3f5c3071a157733fef',1,'operator+(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73ac7a1964fb9064b94b7000ae14b06c',1,'operator+(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c37d85d76f27f899a71677bf2c87965',1,'operator+(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad67577fc0a303c66c31bb1cf11f072f4',1,'operator+(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga463d44e45ae112517e69b59e5c05d2a2',1,'operator+(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d45696a36817a7e03096ccb93efd678',1,'operator+(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab881ab61562effcbdfb223834615cf9b',1,'operator+(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845975ac0aa7a6e6ebcc6a0a5ccd1c6d',1,'operator+(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ba4d696f23852287e920f9e39edbbc',1,'operator+(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32199ebd017e38ef320461f564645fb1',1,'operator+(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a277011ea76600e79758badd705b678',1,'operator+(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab43588987ff4b565dff1496dcd93ceae',1,'operator+(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4152033d3851f97c38b771e239265f04',1,'operator+(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d988af531245304baa08913efeb0640',1,'operator+(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10081f4c12a23d7b318423b00c0db522',1,'operator+(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247ce351637b9c0b52f4915a7d2c4f6b',1,'operator+(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a268a36253f07ca021dcebfee47ad10',1,'operator+(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bbe87b038e1f5206c9d675104f91641',1,'operator+(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab21b3162568bd7ae01f795a239f30ae5',1,'operator+(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f3015dbf9a8bfebccee4ff5f8f0a13',1,'operator+(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15d13e591d5ee6826542214b0b74046d',1,'operator+(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e4033519a3535d8a458fb00ebee1559',1,'operator+(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931953ada1dffe875beabe1f8f7bd030',1,'operator+(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f610a053e45fa3c16c26b8fdac93563',1,'operator+(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ff42a78160f10c832b89c2a7164e9ed',1,'operator+(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c92678779773f7e36cbb585aff566f',1,'operator+(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22ace1eefc87813ef769f102b0b3769d',1,'operator+(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4814b6e72f311d414e0850c0b06ff2c8',1,'operator+(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b9b43b4642e35d27d7ac6daaae1cf1a',1,'operator+(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfe6d281caa0fcb744e38d8bca4c8d10',1,'operator+(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb868810dbd9f370826a464fbfd6b63a',1,'operator+(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafca4bacae455e2b15d9120d3495dd896',1,'operator+(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc478dda6bd01bc954b9c52305187699',1,'operator+(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf711eec1f4565f53cc5b24ffb4a65913',1,'operator+(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4a1f5111573c3bd3ecfd696a6de505',1,'operator+(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c4d7c3df7d674b9ff59c463173a1af5',1,'operator+(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b48c6860baafe07388ea2d096ea63a8',1,'operator+(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81619ea66499b085d6230361d755efd1',1,'operator+(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4abcffbca6e6949ee898f486b7e74862',1,'operator+(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f85134d8553add116bd4111d710dfe6',1,'operator+(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a5b0f36ca97b7681786abe433e95225',1,'operator+(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bca16e176bdf04054bf50edd8434825',1,'operator+(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a7e943cfd42382fe2fcba3fd5b4fc1476',1,'__gnu_cxx::operator+(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ab2b89b39ac900719a3a14e634ec860a5',1,'__gnu_cxx::operator+(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#acc9338b2661112c05017dbdeb21df9c7',1,'__gnu_cxx::operator+(_CharT __lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ab0f3593c273db1a2619a43db92c66efe',1,'__gnu_cxx::operator+(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a72c2b3659c31815c11e1d6b1a1d7e924',1,'__gnu_cxx::operator+(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, _CharT __rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gafa26cb16064a2b5197bfa440c98bdd95',1,'std::operator+(const complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a31fffa82cc0872d928c7d11371c34c49',1,'std::operator+(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae220860a64ea80fb9522daf38053aa8f',1,'std::operator+(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a952b727c802635e947a9a6b64f2f3ed1',1,'std::operator+(_CharT __lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7ba297cc435f21d90383baeebae8652c',1,'std::operator+(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa8298429823127738ccdf0b66e07249e',1,'std::operator+(const basic_string< _CharT, _Traits, _Alloc > &__lhs, _CharT __rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gada3d19f6d35799895239d9d8da91b874',1,'std::operator+(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaaa550f4048e573f92e2fbfae0ce8eab',1,'std::operator+(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga0bc80c123fa74e604e7d598b7e2b3a50',1,'std::operator+(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gafa26cb16064a2b5197bfa440c98bdd95',1,'operator+(const complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gada3d19f6d35799895239d9d8da91b874',1,'operator+(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaaa550f4048e573f92e2fbfae0ce8eab',1,'operator+(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga0bc80c123fa74e604e7d598b7e2b3a50',1,'operator+(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga33a3a90827549220500c99f95b095816',1,'operator+() const(Global Namespace)']]], + ['operator_2b_2b_314',['operator++',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a6a06cf1a5b94057476a925f3f758c490',1,'cv::FileNodeIterator::operator++()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a4daed1197209314a7a9bada1cb21af53',1,'cv::FileNodeIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a70052c25251e3387d8ab80d86febef95',1,'cv::LineIterator::operator++()'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a79c1edcfb30865c5abec03e48f91bcdc',1,'cv::LineIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a7f30a14ed656e99d0297fb028316d23a',1,'cv::MatConstIterator::operator++()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a9ee1e96236b15dcadf6d383db272b49e',1,'cv::MatConstIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ae079204d24a71cbadf489e2a7be4fd17',1,'cv::MatConstIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a04b79539dc9788dd44ffe41dc737f008',1,'cv::MatConstIterator_::operator++(int)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a164083b962b0b7ac8df36e9a90a4fab1',1,'cv::MatIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a3046b334bfa46d6cb19596fe552b4eb9',1,'cv::MatIterator_::operator++(int)'],['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a3e686d47da475b75c9b8ec11723bb2f3',1,'cv::NAryMatIterator::operator++()'],['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a260701f031521ebeac69bcc35c02a0d9',1,'cv::NAryMatIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ad72bcf02305bcfcd92d4006621225fbd',1,'cv::SparseMatConstIterator::operator++()'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ac18bf0568c460ed4a3c652348ef3f6a8',1,'cv::SparseMatConstIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a6c4e03aa55423633e9b7ba5df92530f0',1,'cv::SparseMatConstIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a2a1bbc3e0dcbdd3a08a89397bfad38ee',1,'cv::SparseMatConstIterator_::operator++(int)'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a8685211cc25d171aa9687847a76406c0',1,'cv::SparseMatIterator::operator++()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#aa89c17982bf2f3d1057d2bc09d36462b',1,'cv::SparseMatIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a5dd3f1223ff101fd63a670102e1a805c',1,'cv::SparseMatIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#af5357404aa31635fe16fb7900c24e990',1,'cv::SparseMatIterator_::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#af083e59c576b9e4f483df16b7411c10f',1,'__gnu_debug::_Safe_iterator::operator++() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a0e18ec08b2e93621558f7ba5ced2dda6',1,'__gnu_debug::_Safe_iterator::operator++(int) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#ae86d3f9ac2f797a9231fb441c3a85f04',1,'__gnu_debug::_Safe_local_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a970d20722ad94a43afaa2e4db289f85e',1,'__gnu_debug::_Safe_local_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#ab5ee82c060324ccc10d02831a5270a7c',1,'__gnu_parallel::_GuardedIterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#af083e59c576b9e4f483df16b7411c10f',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator++() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a0e18ec08b2e93621558f7ba5ced2dda6',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator++(int) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#af083e59c576b9e4f483df16b7411c10f',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator++() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a0e18ec08b2e93621558f7ba5ced2dda6',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator++(int) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#aabeb7276d4ce2366c5bb6c9a9f213546',1,'const_iterator_::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#abb2e9ec96985b4c74418481ebb6e47e1',1,'const_iterator_::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#ae3ce4e8d7eab45011fa177454aecf378',1,'iterator_::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#ad5a05ab49fce8dd1c5eb8b807f0d84f5',1,'iterator_::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#a86e4cf04673011aa38c843b3eb44e2f8',1,'std::back_insert_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#ad9e4589271dccb8b64df10af255d4076',1,'std::back_insert_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#aac63c27293526bf0b0c4d4a2472ba785',1,'std::front_insert_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#a0bb8e39402c65287d891388eaea27c8b',1,'std::front_insert_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a66d30004d7402c9067fa8faadd7b8861',1,'std::insert_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a1d81a713bb24ef57aba0ce6dba2a84f0',1,'std::insert_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a4c45d7bfc4e2a3594fb8918017b4ac3a',1,'std::istreambuf_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#adb987d5d42a928df600f5068d8a9e1dc',1,'std::istreambuf_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ad925d614752b837a7147d44d322a6aad',1,'std::ostreambuf_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#a0e9d282823cd7811717ad6bd890f8626',1,'std::ostreambuf_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#af1cd40b1c657b09254c830a6db8bd207',1,'std::regex_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a5cc20a645b74551c5130c8740fe96d9e',1,'std::regex_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a7d7768b8573112a25b0f2a567fd2b72c',1,'std::regex_token_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a699a85d3f9aed40a35d338596b8b2f9e',1,'std::regex_token_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a785ca20b14ac95ee033695423ecf1d53',1,'std::reverse_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a27c37221dec91844c7a72cb9dc28441d',1,'std::reverse_iterator::operator++(int)']]], + ['operator_2b_3d_315',['operator+=',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a77b08ee6b326b9d83ed01de4b30930d2',1,'cv::FileNodeIterator::operator+=()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a52fbb4c870f2c7678c29d892cf8f8307',1,'cv::MatConstIterator::operator+=()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ae423bce6d88387faeb59c63a818b7627',1,'cv::MatConstIterator_::operator+=()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a3bc7e3002fdda7346c15a455352673b2',1,'cv::MatIterator_::operator+=()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'cv::Matx::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'cv::Matx::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< _Tp, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< _Tp, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 1, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 1, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 2 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 2 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float_type, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float_type, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c429977f1b260829de0a009f8105029',1,'cv::softdouble::operator+=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga478a5a673e3131fbfd1c7a357f878023',1,'cv::softfloat::operator+=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'cv::Vec::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'cv::Vec::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< _Tp, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< _Tp, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a4b8715fc8f6a53505b98b9b19b512453',1,'__gnu_cxx::__versa_string::operator+=(const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a79d20017299bbfc786b2d5540e5af61d',1,'__gnu_cxx::__versa_string::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac14c7143cc1a4ed1ad31593b4a8da43b',1,'__gnu_cxx::__versa_string::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a1a409030e39ba995df18fefc38525c2a',1,'__gnu_cxx::__versa_string::operator+=(std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'__gnu_debug::basic_string::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< _CharT >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< _CharT >::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< _CharT >::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< _CharT >::operator+=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(_Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< char >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< char >::operator+=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< char >::operator+=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< char >::operator+=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< value_type >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< value_type >::operator+=(const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< value_type >::operator+=(value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< value_type >::operator+=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'std::basic_string::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'std::basic_string::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'std::basic_string::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'std::basic_string::operator+=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a1994cceaeac8896749a47d2d61e6754f',1,'std::complex::operator+=(const _Tp &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gabf4797890e21e8f0f05b3a73aa215395',1,'std::complex::operator+=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a82884338bf22e5b2e47088240ee3603c',1,'std::fpos::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadaedde83c0c3dc087cd28fede7547179',1,'std::gslice_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaeb7b9d2b39d2312c117a50769114e26c',1,'std::indirect_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga3cd7a0e7c02e60936993f2f8d85d7e14',1,'std::mask_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a2060fd42f847719055e4b416650824ea',1,'std::reverse_iterator::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabffb22fe7508d7fb6b06e4ca76440fc0',1,'std::slice_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga75cc5c668aaade5ccc50b199d789e191',1,'std::valarray::operator+=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8b82cbb5b9eafa8c1fc86ae8678e1f36',1,'std::valarray::operator+=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga75cc5c668aaade5ccc50b199d789e191',1,'valarray< size_t >::operator+=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8b82cbb5b9eafa8c1fc86ae8678e1f36',1,'valarray< size_t >::operator+=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a9cc9fdb4d0d6eb80a45107b86aacbfed',1,'Eigen::ArrayBase::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a9cc9fdb4d0d6eb80a45107b86aacbfed',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a983cc3be0bbe11b3d041a415b76ce010',1,'Eigen::MatrixBase::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a983cc3be0bbe11b3d041a415b76ce010',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a983cc3be0bbe11b3d041a415b76ce010',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a1d2edf8ab80733b8b2620d8c2a3100d3',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'Eigen::VectorwiseOp::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Derived, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Derived, Vertical >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator+=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a40226d9c84fcb9cb948ae0c27b842c57.html#a40226d9c84fcb9cb948ae0c27b842c57',1,'nlohmann::basic_json::operator+=(basic_json &&val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_af643a4baa91f484b11af0e4437183115.html#af643a4baa91f484b11af0e4437183115',1,'nlohmann::basic_json::operator+=(const basic_json &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ae300819781bce2193369609457f70f30.html#ae300819781bce2193369609457f70f30',1,'nlohmann::basic_json::operator+=(const typename object_t::value_type &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac48302a8b4f8c2a6e30c2a7bff6abc49.html#ac48302a8b4f8c2a6e30c2a7bff6abc49',1,'nlohmann::basic_json::operator+=(initializer_list_t init)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1decb593e539029ba11c6fcc72c969cd',1,'cv::operator+=()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ab8d1fddfb94e88c939838e006e23e295',1,'cv::gapi::own::operator+=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga478a5a673e3131fbfd1c7a357f878023',1,'operator+=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c429977f1b260829de0a009f8105029',1,'operator+=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1decb593e539029ba11c6fcc72c969cd',1,'operator+=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gabf4797890e21e8f0f05b3a73aa215395',1,'operator+=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadaedde83c0c3dc087cd28fede7547179',1,'operator+=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga75cc5c668aaade5ccc50b199d789e191',1,'operator+=(const _Tp &)(Global Namespace)']]], + ['operator_2c_316',['operator,',['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html#a769e50401811af082c9e7fe51b7f5e7c',1,'cv::MatCommaInitializer_::operator,()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a76d12259ac3602278c8082f5fdbc9cec',1,'cv::MatxCommaInitializer::operator,()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a76d12259ac3602278c8082f5fdbc9cec',1,'MatxCommaInitializer< _Tp, m, 1 >::operator,()'],['https://docs.opencv.org/4.2.0/d1/d3e/classcv_1_1VecCommaInitializer.html#ad458955e9c77d81d8078d28e3444dcdf',1,'cv::VecCommaInitializer::operator,()']]], + ['operator_2d_317',['operator-',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a4ec58573be20ff741b7f4d21bc223635',1,'cv::FileNodeIterator::operator-(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a4ec58573be20ff741b7f4d21bc223635',1,'cv::FileNodeIterator::operator-(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae07cd7b4ce3474dbdb1a264e2f6e7b0d',1,'cv::MatExpr::operator-(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad424f126a496afadafb4b6c67a1ce174',1,'cv::MatExpr::operator-(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6ed1d63630a0498bae02e4a71e757342',1,'cv::MatExpr::operator-(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a268e1ccaa369123adf2215756e3fae6a',1,'cv::MatExpr::operator-(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad7a022ce69ea48d8d9110cb79ab27b6a',1,'cv::MatExpr::operator-(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab851dfc040860bcf008d19e4a5926b83',1,'cv::MatExpr::operator-(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0d1940f6e797fb5f8092db30db875bdf',1,'cv::MatExpr::operator-(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a881069f5bff2833f6319cf2e7769fdbe',1,'cv::MatExpr::operator-(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaacefdef37dffe5d5214939666fce32f',1,'cv::MatExpr::operator-(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a3e8db9cfa032043f31d40211508653b1',1,'cv::MatExpr::operator-(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a22ebbe4ce388179e64afe917fa369003',1,'cv::MatExpr::operator-(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a09f773558b48e56dfa061179599e11d0',1,'cv::MatExpr::operator-(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae07cd7b4ce3474dbdb1a264e2f6e7b0d',1,'cv::MatExpr::operator-(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad424f126a496afadafb4b6c67a1ce174',1,'cv::MatExpr::operator-(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6ed1d63630a0498bae02e4a71e757342',1,'cv::MatExpr::operator-(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a268e1ccaa369123adf2215756e3fae6a',1,'cv::MatExpr::operator-(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad7a022ce69ea48d8d9110cb79ab27b6a',1,'cv::MatExpr::operator-(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab851dfc040860bcf008d19e4a5926b83',1,'cv::MatExpr::operator-(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0d1940f6e797fb5f8092db30db875bdf',1,'cv::MatExpr::operator-(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a881069f5bff2833f6319cf2e7769fdbe',1,'cv::MatExpr::operator-(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaacefdef37dffe5d5214939666fce32f',1,'cv::MatExpr::operator-(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a3e8db9cfa032043f31d40211508653b1',1,'cv::MatExpr::operator-(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a22ebbe4ce388179e64afe917fa369003',1,'cv::MatExpr::operator-(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a09f773558b48e56dfa061179599e11d0',1,'cv::MatExpr::operator-(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf6a12deaeedcf12e67dc695caff1068',1,'cv::softdouble::operator-(const softdouble &) const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga8150a63cd7bd61db576f3d89082e8b5d',1,'cv::softdouble::operator-() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga00fec559cf58adaedb43c5092df36b84',1,'cv::softfloat::operator-(const softfloat &) const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6d151a3faa03d866700dd46f0ad04a',1,'cv::softfloat::operator-() const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#af2e0577cdf823db2436ffc2c3e5bf5d5',1,'std::fpos::operator-(streamoff __off) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a9cb8084ee1bb8395c4a5e7a937092425',1,'std::fpos::operator-(const fpos &__other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a3942515868778c8f04f5b34fd78d1fce',1,'std::reverse_iterator::operator-()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga028b49a6d0cf1f6afa48149603d953b2',1,'std::valarray::operator-()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga028b49a6d0cf1f6afa48149603d953b2',1,'valarray< size_t >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'Eigen::VectorwiseOp::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Derived, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Derived, Vertical >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator-()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga657904e675f20f6b84d7821cf1b02576',1,'cv::operator-()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5c17b1b5b5fe0b3b4e8e5bd32cbf72b',1,'cv::cudev::operator-(const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8218dac34f71c38487a697ea52557259',1,'cv::cudev::operator-(const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga369f1d0d8d3803abcc6e10bf145d4edd',1,'cv::cudev::operator-(const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cccd86250a11d8e232198edf4251f14',1,'cv::cudev::operator-(const Expr< Body > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafcebc509ca2a96c5b80ab1b96926b5c',1,'cv::cudev::operator-(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32e53e6cd3aa0aec01a90c11008c5a',1,'cv::cudev::operator-(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa812557e00bb932af910630701a2e6d5',1,'cv::cudev::operator-(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga212b4e512e56d38893b3d94109f19e5a',1,'cv::cudev::operator-(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga923d4bc9a45182d9ff86558f8c3b3e1a',1,'cv::cudev::operator-(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf43079f133408f0dd329fa6f1d316f34',1,'cv::cudev::operator-(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5400e7e698ff6fb2a8e8eb929b71e818',1,'cv::cudev::operator-(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07f833d814ae15aa1f7f06fc72285d71',1,'cv::cudev::operator-(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630122d5ecd56ab75dc7a740237d4277',1,'cv::cudev::operator-(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga589105db257ea2341d3edecdbd69e6cf',1,'cv::cudev::operator-(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c02a04ef1608ad485d445c8e43753b8',1,'cv::cudev::operator-(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbd34fbbcf43515301431c8978721c7a',1,'cv::cudev::operator-(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29b58bdfa78ef5c4d4beac53f7c79c35',1,'cv::cudev::operator-(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae523601438b231456102587a02d29ce0',1,'cv::cudev::operator-(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21579d3d75241e52a788ecda484e20d7',1,'cv::cudev::operator-(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae12acf38186bf6dc6895da587665d36c',1,'cv::cudev::operator-(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9befc50cf1641402af105f9b4ce54707',1,'cv::cudev::operator-(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad871c5ff9bf246716e00f7215515a672',1,'cv::cudev::operator-(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ae31a4395b49fa3b233e0c4ee9f78a1',1,'cv::cudev::operator-(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12f0079672bd7bd0b168ce527cb706b',1,'cv::cudev::operator-(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7852adc318a540c056ea73b49ae8286',1,'cv::cudev::operator-(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae414e560eefa2f108503e79e0a92ce79',1,'cv::cudev::operator-(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c78976f9105914f1896abb0b2ab712',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdaf3a734933d300a18e8e1573041e6a',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga595015df8ac886ee6161c8574c07b0bb',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f02e96ae1741da62734d90363e15b',1,'cv::cudev::operator-(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c2ec4b300add3f39cd2c2005fc9b03b',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga671d1eab95a685d83fb46a3caedaa0e4',1,'cv::cudev::operator-(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29088c5390150a10bd5900f805cf9562',1,'cv::cudev::operator-(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17c6cb1c28feab2d8e488026a90f789d',1,'cv::cudev::operator-(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c2b847a8648af7bb1bf5696a5593e1',1,'cv::cudev::operator-(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f2cad4b2513975e900f994e6ed677d6',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657470335930553724a92428b1eb9014',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa406a939d82354cec9279667daa1ca94',1,'cv::cudev::operator-(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b895e1f04d72d46b19f80936c9c0704',1,'cv::cudev::operator-(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49370160c90b69f0c6e98c898b527368',1,'cv::cudev::operator-(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f5ba88d0b852d2f86afc29e06f1e8a',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97c585e4f802affa218b50922504b4d7',1,'cv::cudev::operator-(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b8b588d37850f2a9d96602a6a5f7d67',1,'cv::cudev::operator-(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga222ce3784f3fc6433767ce8cdaa827f7',1,'cv::cudev::operator-(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2828d795db4524ad86acf6438336fa',1,'cv::cudev::operator-(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2684b612027b487618841db6c1850313',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7d0852b020342bc37b7e507a587905a',1,'cv::cudev::operator-(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9529413b121c4e0c8ee22482a4fab970',1,'cv::cudev::operator-(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5bf61216767dfa9c63290c776fc9dc30',1,'cv::cudev::operator-(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafffe9e12abf7a2013c656198bbfe4019',1,'cv::cudev::operator-(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f600b61f1a94b779ce862a1b2ddc83e',1,'cv::cudev::operator-(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3492f3658fe0c7b45d288f0700124307',1,'cv::cudev::operator-(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0ec17613882c822c1684d5e67aa3ff0',1,'cv::cudev::operator-(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01f9a0cf5655a5f3c4c2e78bde998754',1,'cv::cudev::operator-(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c66bc85731db1174c2eae7646fe8ae',1,'cv::cudev::operator-(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd83b96a13731954f8723e2275e3765',1,'cv::cudev::operator-(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157fca7e19a61dbf087d7654594d4e23',1,'cv::cudev::operator-(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55f1af68b4a753b3a6a3e078d91f1696',1,'cv::cudev::operator-(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf4e04da6c7b24130e4cc8e776a5339a',1,'cv::cudev::operator-(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73809cf57d17ff44a52c02c3b29ecfba',1,'cv::cudev::operator-(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6d871842daa1c70ea4caef8a76670ab',1,'cv::cudev::operator-(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3923c285bfc32ef157d97af42b4dbaa',1,'cv::cudev::operator-(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3091968102f4293b8a37fa22c26fde15',1,'cv::cudev::operator-(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga105d05b599ef729df2112db1626078c9',1,'cv::cudev::operator-(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fc141b8ac2f6e3aeba0e32424591d9',1,'cv::cudev::operator-(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c28d9ff3a737dfe37508d1608d4488',1,'cv::cudev::operator-(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace86d625860816056a815a5ac249841f',1,'cv::cudev::operator-(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c83494077d790efb9cce651ef5c8fb3',1,'cv::cudev::operator-(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fcb4deeb33df8bb7fabc3afdc922947',1,'cv::cudev::operator-(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d0e94e2a3ddb20e082a36b760b374c',1,'cv::cudev::operator-(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf528d8dbd1cb9132a7d8acc3f11b0a89',1,'cv::cudev::operator-(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd1c46a4dceccd18eff03077f8e8da83',1,'cv::cudev::operator-(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26feff449ac4dab327561cc7b98ae303',1,'cv::cudev::operator-(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f0d316266abadce36d9f95350939051',1,'cv::cudev::operator-(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a790596a24ef36db89348e75d2858c',1,'cv::cudev::operator-(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cebc4fe6b6f94f836752ced678af6d6',1,'cv::cudev::operator-(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7912128120aa37fc63d046a614da79',1,'cv::cudev::operator-(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31fa210affd71e287fb5e9b483d8b4b7',1,'cv::cudev::operator-(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39a6f71ae25763350c835bab9dde6025',1,'cv::cudev::operator-(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c17045262474d8006617bf00a10ada',1,'cv::cudev::operator-(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3af755936e984d2d83fe6b1f520d014',1,'cv::cudev::operator-(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff766239f9095c4845abc49acf0e2dd0',1,'cv::cudev::operator-(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga750fd24726debf7081fb1118125a6775',1,'cv::cudev::operator-(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae62193899bb9cc343fa962b4b521e36c',1,'cv::cudev::operator-(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166ed0bcb9dd638829729f92695b12d0',1,'cv::cudev::operator-(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80d8077257094293bb466dab861ac473',1,'cv::cudev::operator-(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772e599865fe047c41f93d58af5c36be',1,'cv::cudev::operator-(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d7fa5317dd05a15f21aa3be368d6c79',1,'cv::cudev::operator-(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafecaf20edf9038a419b4963a649f1362',1,'cv::cudev::operator-(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a7b9dbe190b22a08f72e3f9334e3171',1,'cv::cudev::operator-(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60818b7e8929ee3491aad14dc0bbf7e7',1,'cv::cudev::operator-(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55574f511139402e4cd6820b2e3edeba',1,'cv::cudev::operator-(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9d8281a359296fae7b6ec188101ed8e',1,'cv::cudev::operator-(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7dad42ade73d46813a094b64808c6b8',1,'cv::cudev::operator-(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d789399fa52f9690e6e01fe8d653bc9',1,'cv::cudev::operator-(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24bad9cc2b3b3ac10c819d8fd2ae54e',1,'cv::cudev::operator-(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga064176b3aa847d4e254c1ec1db3f8324',1,'cv::cudev::operator-(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb5d9702bcfe0a2527b510cc84938a4',1,'cv::cudev::operator-(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga459d5db54e31c46b4c5982f98e42fa77',1,'cv::cudev::operator-(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb64bc3f5c6ee79fc1869e51e0e20ea',1,'cv::cudev::operator-(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab72d0df44e48d58d0a83680bcc64c0cd',1,'cv::cudev::operator-(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f14ce38edfb19ba6890f42c9e4bc1c7',1,'cv::cudev::operator-(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ca19596afc498b95a6a7b19375e2776',1,'cv::cudev::operator-(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga830cd97a436668d9feeb2ff08daead24',1,'cv::cudev::operator-(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0447438f3f039aaf24fe21d502153a6c',1,'cv::cudev::operator-(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac95b6a94f1155b246a18f3b845e3cfa7',1,'cv::cudev::operator-(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabecf086f97f0c60573f81155ce6df359',1,'cv::cudev::operator-(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa1778a2f54eb6eafc3a395173fac5b',1,'cv::cudev::operator-(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c69722cf7d46b2ca923926d0a9e7c29',1,'cv::cudev::operator-(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301f25e5157f16b4a044760a1ba51957',1,'cv::cudev::operator-(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga234301df3e003ce08fa1154a6919c3e6',1,'cv::cudev::operator-(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga529a4056534c5e47aa59d256ad69795b',1,'cv::cudev::operator-(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe950dd17a8fa089fe286dc7513ed18b',1,'cv::cudev::operator-(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51346e7356a9c330b5874b3e3e8fdf7a',1,'cv::cudev::operator-(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga087dd0f490602b7f5212a8221cc4c631',1,'cv::cudev::operator-(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa922d047700892efb47a39e2b66e2df7',1,'cv::cudev::operator-(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga030665610f8a68470affbb8fc223480a',1,'cv::cudev::operator-(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9334f4344c1d1203f4e78bad75c7f7ac',1,'cv::cudev::operator-(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c175694697819d86c134405fef567d',1,'cv::cudev::operator-(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c871fd39d365299a7087e48c132e66',1,'cv::cudev::operator-(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35c6854bb46e9164eec0218f869a9b9',1,'cv::cudev::operator-(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97621dfd01d12393ecd93025efb3565f',1,'cv::cudev::operator-(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb1c3da793075b09989fc44ae3f1b9ed',1,'cv::cudev::operator-(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f6f8843f95be97da2d9dd97203a57a7',1,'cv::cudev::operator-(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4b21b2c12c7e804eff3159893bf0da',1,'cv::cudev::operator-(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f8acd15bb673d2ddb88d3fc032f7f46',1,'cv::cudev::operator-(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b1a551cfaf5a99c6fe30782af1dee38',1,'cv::cudev::operator-(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8718012438f8242708e0e7c59e30c0f3',1,'cv::cudev::operator-(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b256b2cc48a9181623a38977e3bac00',1,'cv::cudev::operator-(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58ed6ef928b50877a894f409e8464ac2',1,'cv::cudev::operator-(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77dd6b885a2b9b9b4c44d74be2dbfd74',1,'cv::cudev::operator-(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga599164264373b33e0a535211c0fdccb5',1,'cv::cudev::operator-(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99636b5731e60af2c22851c30f4e1cc2',1,'cv::cudev::operator-(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f068655bf1a117d63ee8d12c9123bc',1,'cv::cudev::operator-(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68155cb7567a70e34854e308bad38bf0',1,'cv::cudev::operator-(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6789124b74d1f4bd32bcbbf0501d6bd',1,'cv::cudev::operator-(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c14a811c0156b0a39c727300af59a3d',1,'cv::cudev::operator-(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628b15bea2200f623235e780644b4738',1,'cv::cudev::operator-(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaed8862546424053275a74eb182123b1',1,'cv::cudev::operator-(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf917f33a395906b4ee4b0d09d3abb4fa',1,'cv::cudev::operator-(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c898d588a40dd071eec1f8c2c74b39f',1,'cv::cudev::operator-(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd0d6d85ac669a3f90307e30aa3cbe00',1,'cv::cudev::operator-(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e5740217efa8fe0abf0abcc760328d',1,'cv::cudev::operator-(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9dd88cc2cbce6d9e4778d60fc7921f7',1,'cv::cudev::operator-(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b9334faac50e773d70fc8dfd0b5ecbe',1,'cv::cudev::operator-(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e525a4e0063c46db0f94eeb30818210',1,'cv::cudev::operator-(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81998f25744b975fc9ad36d109ac830b',1,'cv::cudev::operator-(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd199a5f6d3af032060b2c2d22651ba0',1,'cv::cudev::operator-(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587458f4a3b6baaae54d1bf38c608fdd',1,'cv::cudev::operator-(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c43181792568fdac96ab1f34606f45',1,'cv::cudev::operator-(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad30d5dabcda24d862172a45f57790b0d',1,'cv::cudev::operator-(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71cc98fe99d705fe3f356355a5972c54',1,'cv::cudev::operator-(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae1659d27c0d33e75d72445deaf55930',1,'cv::cudev::operator-(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98feed4df5a73a8ddd6d51b8321af344',1,'cv::cudev::operator-(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b4b59a36beb43c49f01fb86f1bc890',1,'cv::cudev::operator-(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0775017854d4e2b772d672168bd9a5c',1,'cv::cudev::operator-(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b1fa561df0ed7972108d66f89c5c496',1,'cv::cudev::operator-(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf9102f7c51e3a2d88b9073206820a55',1,'cv::cudev::operator-(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2316196b4a8bd1c46e519dd2fc4c3851',1,'cv::cudev::operator-(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3075a67dd4ae9b7543c5e4c897f5ff45',1,'cv::cudev::operator-(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9ba6b5d0f5f1a8ed6d93e4f0ab5e173',1,'cv::cudev::operator-(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedcf75a12dd00e1c503c9106e44a3e98',1,'cv::cudev::operator-(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01b9153cf9b4f0369155cb594e2d1349',1,'cv::cudev::operator-(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ff1bf6c7c124e0c8bd913479790866a',1,'cv::cudev::operator-(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabed2cc5868115ee18468aa3cebb3be19',1,'cv::cudev::operator-(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e312d4b86154b204240572d9e86effd',1,'cv::cudev::operator-(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0418e4172197c9fa9dcd41c9fb3b20f9',1,'cv::cudev::operator-(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b532e3190010cf8358b124e3dde328',1,'cv::cudev::operator-(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195ae36c11666e48a9947af768d97b44',1,'cv::cudev::operator-(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b120b8e056fc331b8069bf1a9ed6fff',1,'cv::cudev::operator-(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8362b5b231be23340c5fb8b99cbb375e',1,'cv::cudev::operator-(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga082c28863107b352ac51038a23d06300',1,'cv::cudev::operator-(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga915ab09a582414ca39929cdb812f758a',1,'cv::cudev::operator-(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ea8ddbac826668fdc04ab8f99e66d9',1,'cv::cudev::operator-(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc941af3597d7061a0661159a5469162',1,'cv::cudev::operator-(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94ea2c59d0991a2fc0298c7f5a24e50',1,'cv::cudev::operator-(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2270da17955731575fe008dc96c80bda',1,'cv::cudev::operator-(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ffb86ec221c92f569ae47db8d52119b',1,'cv::cudev::operator-(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab28b46e72d03a0922e710b43695f2',1,'cv::cudev::operator-(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga145db2039b6488ede1742843b830bbb2',1,'cv::cudev::operator-(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf3a6db03ab93d4b436c9f15c1e465a8',1,'cv::cudev::operator-(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6255c2cad7df67e3ad4f26a084d74747',1,'cv::cudev::operator-(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c8779b714a767af06374cf179cd7658',1,'cv::cudev::operator-(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3588ea327af30d0380dbf86c67fbbe26',1,'cv::cudev::operator-(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f7485ba0075a5d14504be9792dd6cda',1,'cv::cudev::operator-(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87cd3d2a3cfacd0af275e8f65e593c07',1,'cv::cudev::operator-(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga431f094ce3f6ed4a524c1456032d1e5c',1,'cv::cudev::operator-(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cb9157344792d1668368b76d2b53ef0',1,'cv::cudev::operator-(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e51e2db4cf854a1b534e27fef30aea5',1,'cv::cudev::operator-(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00481995ead0bbef7bcaabe8670ab440',1,'cv::cudev::operator-(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f6440ffc7c49757d421ff30eec6483a',1,'cv::cudev::operator-(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c8857ba62a6011efbd8731351b3668',1,'cv::cudev::operator-(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf70bf655a23b655608d8076f4feee13',1,'cv::cudev::operator-(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe035a4f4b0e3ea2ea1b7026a6c67dcd',1,'cv::cudev::operator-(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14497e7403c99dfbc1ff4bedc3d68f6',1,'cv::cudev::operator-(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d805c90bfeba48408241237e149aae6',1,'cv::cudev::operator-(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8a8ad77bfd017bc91c32cf644962ab7',1,'cv::cudev::operator-(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabdaef661a90228ba7259c77122b9a03',1,'cv::cudev::operator-(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e260d1cb3780fad10c72cadc0c49c0f',1,'cv::cudev::operator-(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf94b2d97816dcd6619274fb4feeae0f5',1,'cv::cudev::operator-(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2144e86d0a8c877122ccb1cbcfe55524',1,'cv::cudev::operator-(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a39a0486a0d1f390b5f009cb61d18d9',1,'cv::cudev::operator-(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcef7c7a90b8afae18f0e59c1e1ade46',1,'cv::cudev::operator-(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8802eb31440714af8c5920c08a8fbaf8',1,'cv::cudev::operator-(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf470cfb079490ca0efc9e425d8a23737',1,'cv::cudev::operator-(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b0501a5e044aaf1b9138c442f2422c2',1,'cv::cudev::operator-(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd60b5d630bd0b3ae6a4d8f53c5205',1,'cv::cudev::operator-(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1c549d5b7cc2b71327ce10502f39db',1,'cv::cudev::operator-(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99eba581458fcdf17f4e91d73459ce96',1,'cv::cudev::operator-(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c920201791dc95f7e59f0a77524a4d9',1,'cv::cudev::operator-(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf83e424e36e12a70fed05d67393f4fa9',1,'cv::cudev::operator-(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga869ba8c0391f2954ec9b51b84e4cb037',1,'cv::cudev::operator-(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286015c3a12eb08da7fee407884e7f35',1,'cv::cudev::operator-(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadece9875b31689e0880c626826fa8a14',1,'cv::cudev::operator-(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa095d5d102f9325c5700eb1fd989f69b',1,'cv::cudev::operator-(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga835e06caee26a307b42ac4b6cae3eb36',1,'cv::cudev::operator-(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f1f7629c16642fa581b16c2898a05ff',1,'cv::cudev::operator-(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf868783fdecde414693bbcb9db17628e',1,'cv::cudev::operator-(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga213848161d7be3d9c73dba5e709b079b',1,'cv::cudev::operator-(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac118a8f2d822cd667b833e12a796be34',1,'cv::cudev::operator-(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae51bb9b05a4f76f5c3a01cf3db5962',1,'cv::cudev::operator-(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d855d60a702b3918c841a26570601a3',1,'cv::cudev::operator-(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e27485d93087eacf685d1498e74f556',1,'cv::cudev::operator-(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5d66d9588e722109b30fac960662e64',1,'cv::cudev::operator-(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34688ab71722659850f777051315dc27',1,'cv::cudev::operator-(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga557b681e893a841fe02f17a00d62eaa1',1,'cv::cudev::operator-(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf80315d6f88dfcbcf02c76f8ee8f953c',1,'cv::cudev::operator-(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa89552d0de95801c80b2bb3a5e6435d1',1,'cv::cudev::operator-(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf23698f18f04d1250221e6746b4c9810',1,'cv::cudev::operator-(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fd1d6f3e17ba35584f39da603e25c82',1,'cv::cudev::operator-(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f33fccdd0d3fa940bd3f443b24f8d5',1,'cv::cudev::operator-(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ceff4b71ebb6b58c8efdb4de80df7cb',1,'cv::cudev::operator-(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236c690b63999f1e9f07c84fb1dedc5f',1,'cv::cudev::operator-(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1094d7d71d2aefc1869c72347e53d09f',1,'cv::cudev::operator-(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ce9e9e1c97e5f00df933988651acc3',1,'cv::cudev::operator-(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga183b0f68b7e993cf1d10ce74cf656f63',1,'cv::cudev::operator-(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c95d1121a4fd678e416dd219bc2eff2',1,'cv::cudev::operator-(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2c1e422a17e927b9bc13516d09691ef',1,'cv::cudev::operator-(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga377b580b41f8a05440b4a4298e79847c',1,'cv::cudev::operator-(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbdfcaf718602ea178cefb40abc3199b',1,'cv::cudev::operator-(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50daff19a60364c8d50211b6150f7bde',1,'cv::cudev::operator-(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46d693e48f72432105a7694db15cb16b',1,'cv::cudev::operator-(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c2a9c4da615af916d394e1357098827',1,'cv::cudev::operator-(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa834729f3bf1a45f6bccba9dc8df5872',1,'cv::cudev::operator-(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c42e1c911cd6ced910f9c7c39e6217',1,'cv::cudev::operator-(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28c6d90fc518cd3304a57dfc88446779',1,'cv::cudev::operator-(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07106a51535e185bcf711ed49575530d',1,'cv::cudev::operator-(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4c9e88d426e7f6991f6e34b107f56cc',1,'cv::cudev::operator-(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga00fec559cf58adaedb43c5092df36b84',1,'operator-(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6d151a3faa03d866700dd46f0ad04a',1,'operator-() const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf6a12deaeedcf12e67dc695caff1068',1,'operator-(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga657904e675f20f6b84d7821cf1b02576',1,'operator-(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5c17b1b5b5fe0b3b4e8e5bd32cbf72b',1,'operator-(const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8218dac34f71c38487a697ea52557259',1,'operator-(const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga369f1d0d8d3803abcc6e10bf145d4edd',1,'operator-(const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cccd86250a11d8e232198edf4251f14',1,'operator-(const Expr< Body > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafcebc509ca2a96c5b80ab1b96926b5c',1,'operator-(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32e53e6cd3aa0aec01a90c11008c5a',1,'operator-(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa812557e00bb932af910630701a2e6d5',1,'operator-(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga212b4e512e56d38893b3d94109f19e5a',1,'operator-(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga923d4bc9a45182d9ff86558f8c3b3e1a',1,'operator-(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf43079f133408f0dd329fa6f1d316f34',1,'operator-(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5400e7e698ff6fb2a8e8eb929b71e818',1,'operator-(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07f833d814ae15aa1f7f06fc72285d71',1,'operator-(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630122d5ecd56ab75dc7a740237d4277',1,'operator-(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga589105db257ea2341d3edecdbd69e6cf',1,'operator-(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c02a04ef1608ad485d445c8e43753b8',1,'operator-(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbd34fbbcf43515301431c8978721c7a',1,'operator-(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29b58bdfa78ef5c4d4beac53f7c79c35',1,'operator-(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae523601438b231456102587a02d29ce0',1,'operator-(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21579d3d75241e52a788ecda484e20d7',1,'operator-(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae12acf38186bf6dc6895da587665d36c',1,'operator-(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9befc50cf1641402af105f9b4ce54707',1,'operator-(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad871c5ff9bf246716e00f7215515a672',1,'operator-(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ae31a4395b49fa3b233e0c4ee9f78a1',1,'operator-(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12f0079672bd7bd0b168ce527cb706b',1,'operator-(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7852adc318a540c056ea73b49ae8286',1,'operator-(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae414e560eefa2f108503e79e0a92ce79',1,'operator-(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c78976f9105914f1896abb0b2ab712',1,'operator-(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdaf3a734933d300a18e8e1573041e6a',1,'operator-(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga595015df8ac886ee6161c8574c07b0bb',1,'operator-(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f02e96ae1741da62734d90363e15b',1,'operator-(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c2ec4b300add3f39cd2c2005fc9b03b',1,'operator-(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga671d1eab95a685d83fb46a3caedaa0e4',1,'operator-(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29088c5390150a10bd5900f805cf9562',1,'operator-(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17c6cb1c28feab2d8e488026a90f789d',1,'operator-(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c2b847a8648af7bb1bf5696a5593e1',1,'operator-(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f2cad4b2513975e900f994e6ed677d6',1,'operator-(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657470335930553724a92428b1eb9014',1,'operator-(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa406a939d82354cec9279667daa1ca94',1,'operator-(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b895e1f04d72d46b19f80936c9c0704',1,'operator-(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49370160c90b69f0c6e98c898b527368',1,'operator-(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f5ba88d0b852d2f86afc29e06f1e8a',1,'operator-(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97c585e4f802affa218b50922504b4d7',1,'operator-(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b8b588d37850f2a9d96602a6a5f7d67',1,'operator-(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga222ce3784f3fc6433767ce8cdaa827f7',1,'operator-(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2828d795db4524ad86acf6438336fa',1,'operator-(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2684b612027b487618841db6c1850313',1,'operator-(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7d0852b020342bc37b7e507a587905a',1,'operator-(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9529413b121c4e0c8ee22482a4fab970',1,'operator-(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5bf61216767dfa9c63290c776fc9dc30',1,'operator-(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafffe9e12abf7a2013c656198bbfe4019',1,'operator-(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f600b61f1a94b779ce862a1b2ddc83e',1,'operator-(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3492f3658fe0c7b45d288f0700124307',1,'operator-(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0ec17613882c822c1684d5e67aa3ff0',1,'operator-(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01f9a0cf5655a5f3c4c2e78bde998754',1,'operator-(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c66bc85731db1174c2eae7646fe8ae',1,'operator-(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd83b96a13731954f8723e2275e3765',1,'operator-(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157fca7e19a61dbf087d7654594d4e23',1,'operator-(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55f1af68b4a753b3a6a3e078d91f1696',1,'operator-(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf4e04da6c7b24130e4cc8e776a5339a',1,'operator-(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73809cf57d17ff44a52c02c3b29ecfba',1,'operator-(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6d871842daa1c70ea4caef8a76670ab',1,'operator-(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3923c285bfc32ef157d97af42b4dbaa',1,'operator-(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3091968102f4293b8a37fa22c26fde15',1,'operator-(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga105d05b599ef729df2112db1626078c9',1,'operator-(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fc141b8ac2f6e3aeba0e32424591d9',1,'operator-(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c28d9ff3a737dfe37508d1608d4488',1,'operator-(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace86d625860816056a815a5ac249841f',1,'operator-(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c83494077d790efb9cce651ef5c8fb3',1,'operator-(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fcb4deeb33df8bb7fabc3afdc922947',1,'operator-(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d0e94e2a3ddb20e082a36b760b374c',1,'operator-(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf528d8dbd1cb9132a7d8acc3f11b0a89',1,'operator-(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd1c46a4dceccd18eff03077f8e8da83',1,'operator-(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26feff449ac4dab327561cc7b98ae303',1,'operator-(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f0d316266abadce36d9f95350939051',1,'operator-(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a790596a24ef36db89348e75d2858c',1,'operator-(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cebc4fe6b6f94f836752ced678af6d6',1,'operator-(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7912128120aa37fc63d046a614da79',1,'operator-(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31fa210affd71e287fb5e9b483d8b4b7',1,'operator-(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39a6f71ae25763350c835bab9dde6025',1,'operator-(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c17045262474d8006617bf00a10ada',1,'operator-(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3af755936e984d2d83fe6b1f520d014',1,'operator-(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff766239f9095c4845abc49acf0e2dd0',1,'operator-(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga750fd24726debf7081fb1118125a6775',1,'operator-(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae62193899bb9cc343fa962b4b521e36c',1,'operator-(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166ed0bcb9dd638829729f92695b12d0',1,'operator-(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80d8077257094293bb466dab861ac473',1,'operator-(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772e599865fe047c41f93d58af5c36be',1,'operator-(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d7fa5317dd05a15f21aa3be368d6c79',1,'operator-(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafecaf20edf9038a419b4963a649f1362',1,'operator-(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a7b9dbe190b22a08f72e3f9334e3171',1,'operator-(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60818b7e8929ee3491aad14dc0bbf7e7',1,'operator-(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55574f511139402e4cd6820b2e3edeba',1,'operator-(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9d8281a359296fae7b6ec188101ed8e',1,'operator-(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7dad42ade73d46813a094b64808c6b8',1,'operator-(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d789399fa52f9690e6e01fe8d653bc9',1,'operator-(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24bad9cc2b3b3ac10c819d8fd2ae54e',1,'operator-(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga064176b3aa847d4e254c1ec1db3f8324',1,'operator-(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb5d9702bcfe0a2527b510cc84938a4',1,'operator-(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga459d5db54e31c46b4c5982f98e42fa77',1,'operator-(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb64bc3f5c6ee79fc1869e51e0e20ea',1,'operator-(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab72d0df44e48d58d0a83680bcc64c0cd',1,'operator-(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f14ce38edfb19ba6890f42c9e4bc1c7',1,'operator-(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ca19596afc498b95a6a7b19375e2776',1,'operator-(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga830cd97a436668d9feeb2ff08daead24',1,'operator-(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0447438f3f039aaf24fe21d502153a6c',1,'operator-(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac95b6a94f1155b246a18f3b845e3cfa7',1,'operator-(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabecf086f97f0c60573f81155ce6df359',1,'operator-(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa1778a2f54eb6eafc3a395173fac5b',1,'operator-(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c69722cf7d46b2ca923926d0a9e7c29',1,'operator-(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301f25e5157f16b4a044760a1ba51957',1,'operator-(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga234301df3e003ce08fa1154a6919c3e6',1,'operator-(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga529a4056534c5e47aa59d256ad69795b',1,'operator-(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe950dd17a8fa089fe286dc7513ed18b',1,'operator-(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51346e7356a9c330b5874b3e3e8fdf7a',1,'operator-(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga087dd0f490602b7f5212a8221cc4c631',1,'operator-(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa922d047700892efb47a39e2b66e2df7',1,'operator-(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga030665610f8a68470affbb8fc223480a',1,'operator-(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9334f4344c1d1203f4e78bad75c7f7ac',1,'operator-(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c175694697819d86c134405fef567d',1,'operator-(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c871fd39d365299a7087e48c132e66',1,'operator-(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35c6854bb46e9164eec0218f869a9b9',1,'operator-(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97621dfd01d12393ecd93025efb3565f',1,'operator-(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb1c3da793075b09989fc44ae3f1b9ed',1,'operator-(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f6f8843f95be97da2d9dd97203a57a7',1,'operator-(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4b21b2c12c7e804eff3159893bf0da',1,'operator-(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f8acd15bb673d2ddb88d3fc032f7f46',1,'operator-(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b1a551cfaf5a99c6fe30782af1dee38',1,'operator-(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8718012438f8242708e0e7c59e30c0f3',1,'operator-(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b256b2cc48a9181623a38977e3bac00',1,'operator-(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58ed6ef928b50877a894f409e8464ac2',1,'operator-(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77dd6b885a2b9b9b4c44d74be2dbfd74',1,'operator-(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga599164264373b33e0a535211c0fdccb5',1,'operator-(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99636b5731e60af2c22851c30f4e1cc2',1,'operator-(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f068655bf1a117d63ee8d12c9123bc',1,'operator-(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68155cb7567a70e34854e308bad38bf0',1,'operator-(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6789124b74d1f4bd32bcbbf0501d6bd',1,'operator-(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c14a811c0156b0a39c727300af59a3d',1,'operator-(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628b15bea2200f623235e780644b4738',1,'operator-(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaed8862546424053275a74eb182123b1',1,'operator-(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf917f33a395906b4ee4b0d09d3abb4fa',1,'operator-(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c898d588a40dd071eec1f8c2c74b39f',1,'operator-(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd0d6d85ac669a3f90307e30aa3cbe00',1,'operator-(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e5740217efa8fe0abf0abcc760328d',1,'operator-(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9dd88cc2cbce6d9e4778d60fc7921f7',1,'operator-(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b9334faac50e773d70fc8dfd0b5ecbe',1,'operator-(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e525a4e0063c46db0f94eeb30818210',1,'operator-(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81998f25744b975fc9ad36d109ac830b',1,'operator-(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd199a5f6d3af032060b2c2d22651ba0',1,'operator-(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587458f4a3b6baaae54d1bf38c608fdd',1,'operator-(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c43181792568fdac96ab1f34606f45',1,'operator-(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad30d5dabcda24d862172a45f57790b0d',1,'operator-(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71cc98fe99d705fe3f356355a5972c54',1,'operator-(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae1659d27c0d33e75d72445deaf55930',1,'operator-(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98feed4df5a73a8ddd6d51b8321af344',1,'operator-(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b4b59a36beb43c49f01fb86f1bc890',1,'operator-(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0775017854d4e2b772d672168bd9a5c',1,'operator-(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b1fa561df0ed7972108d66f89c5c496',1,'operator-(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf9102f7c51e3a2d88b9073206820a55',1,'operator-(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2316196b4a8bd1c46e519dd2fc4c3851',1,'operator-(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3075a67dd4ae9b7543c5e4c897f5ff45',1,'operator-(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9ba6b5d0f5f1a8ed6d93e4f0ab5e173',1,'operator-(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedcf75a12dd00e1c503c9106e44a3e98',1,'operator-(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01b9153cf9b4f0369155cb594e2d1349',1,'operator-(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ff1bf6c7c124e0c8bd913479790866a',1,'operator-(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabed2cc5868115ee18468aa3cebb3be19',1,'operator-(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e312d4b86154b204240572d9e86effd',1,'operator-(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0418e4172197c9fa9dcd41c9fb3b20f9',1,'operator-(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b532e3190010cf8358b124e3dde328',1,'operator-(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195ae36c11666e48a9947af768d97b44',1,'operator-(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b120b8e056fc331b8069bf1a9ed6fff',1,'operator-(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8362b5b231be23340c5fb8b99cbb375e',1,'operator-(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga082c28863107b352ac51038a23d06300',1,'operator-(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga915ab09a582414ca39929cdb812f758a',1,'operator-(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ea8ddbac826668fdc04ab8f99e66d9',1,'operator-(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc941af3597d7061a0661159a5469162',1,'operator-(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94ea2c59d0991a2fc0298c7f5a24e50',1,'operator-(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2270da17955731575fe008dc96c80bda',1,'operator-(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ffb86ec221c92f569ae47db8d52119b',1,'operator-(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab28b46e72d03a0922e710b43695f2',1,'operator-(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga145db2039b6488ede1742843b830bbb2',1,'operator-(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf3a6db03ab93d4b436c9f15c1e465a8',1,'operator-(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6255c2cad7df67e3ad4f26a084d74747',1,'operator-(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c8779b714a767af06374cf179cd7658',1,'operator-(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3588ea327af30d0380dbf86c67fbbe26',1,'operator-(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f7485ba0075a5d14504be9792dd6cda',1,'operator-(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87cd3d2a3cfacd0af275e8f65e593c07',1,'operator-(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga431f094ce3f6ed4a524c1456032d1e5c',1,'operator-(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cb9157344792d1668368b76d2b53ef0',1,'operator-(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e51e2db4cf854a1b534e27fef30aea5',1,'operator-(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00481995ead0bbef7bcaabe8670ab440',1,'operator-(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f6440ffc7c49757d421ff30eec6483a',1,'operator-(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c8857ba62a6011efbd8731351b3668',1,'operator-(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf70bf655a23b655608d8076f4feee13',1,'operator-(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe035a4f4b0e3ea2ea1b7026a6c67dcd',1,'operator-(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14497e7403c99dfbc1ff4bedc3d68f6',1,'operator-(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d805c90bfeba48408241237e149aae6',1,'operator-(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8a8ad77bfd017bc91c32cf644962ab7',1,'operator-(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabdaef661a90228ba7259c77122b9a03',1,'operator-(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e260d1cb3780fad10c72cadc0c49c0f',1,'operator-(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf94b2d97816dcd6619274fb4feeae0f5',1,'operator-(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2144e86d0a8c877122ccb1cbcfe55524',1,'operator-(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a39a0486a0d1f390b5f009cb61d18d9',1,'operator-(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcef7c7a90b8afae18f0e59c1e1ade46',1,'operator-(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8802eb31440714af8c5920c08a8fbaf8',1,'operator-(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf470cfb079490ca0efc9e425d8a23737',1,'operator-(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b0501a5e044aaf1b9138c442f2422c2',1,'operator-(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd60b5d630bd0b3ae6a4d8f53c5205',1,'operator-(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1c549d5b7cc2b71327ce10502f39db',1,'operator-(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99eba581458fcdf17f4e91d73459ce96',1,'operator-(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c920201791dc95f7e59f0a77524a4d9',1,'operator-(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf83e424e36e12a70fed05d67393f4fa9',1,'operator-(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga869ba8c0391f2954ec9b51b84e4cb037',1,'operator-(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286015c3a12eb08da7fee407884e7f35',1,'operator-(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadece9875b31689e0880c626826fa8a14',1,'operator-(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa095d5d102f9325c5700eb1fd989f69b',1,'operator-(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga835e06caee26a307b42ac4b6cae3eb36',1,'operator-(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f1f7629c16642fa581b16c2898a05ff',1,'operator-(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf868783fdecde414693bbcb9db17628e',1,'operator-(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga213848161d7be3d9c73dba5e709b079b',1,'operator-(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac118a8f2d822cd667b833e12a796be34',1,'operator-(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae51bb9b05a4f76f5c3a01cf3db5962',1,'operator-(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d855d60a702b3918c841a26570601a3',1,'operator-(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e27485d93087eacf685d1498e74f556',1,'operator-(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5d66d9588e722109b30fac960662e64',1,'operator-(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34688ab71722659850f777051315dc27',1,'operator-(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga557b681e893a841fe02f17a00d62eaa1',1,'operator-(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf80315d6f88dfcbcf02c76f8ee8f953c',1,'operator-(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa89552d0de95801c80b2bb3a5e6435d1',1,'operator-(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf23698f18f04d1250221e6746b4c9810',1,'operator-(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fd1d6f3e17ba35584f39da603e25c82',1,'operator-(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f33fccdd0d3fa940bd3f443b24f8d5',1,'operator-(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ceff4b71ebb6b58c8efdb4de80df7cb',1,'operator-(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236c690b63999f1e9f07c84fb1dedc5f',1,'operator-(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1094d7d71d2aefc1869c72347e53d09f',1,'operator-(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ce9e9e1c97e5f00df933988651acc3',1,'operator-(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga183b0f68b7e993cf1d10ce74cf656f63',1,'operator-(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c95d1121a4fd678e416dd219bc2eff2',1,'operator-(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2c1e422a17e927b9bc13516d09691ef',1,'operator-(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga377b580b41f8a05440b4a4298e79847c',1,'operator-(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbdfcaf718602ea178cefb40abc3199b',1,'operator-(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50daff19a60364c8d50211b6150f7bde',1,'operator-(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46d693e48f72432105a7694db15cb16b',1,'operator-(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c2a9c4da615af916d394e1357098827',1,'operator-(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa834729f3bf1a45f6bccba9dc8df5872',1,'operator-(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c42e1c911cd6ced910f9c7c39e6217',1,'operator-(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28c6d90fc518cd3304a57dfc88446779',1,'operator-(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07106a51535e185bcf711ed49575530d',1,'operator-(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4c9e88d426e7f6991f6e34b107f56cc',1,'operator-(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaab018c47cc4e8f0dfa471622a784677b',1,'std::operator-(const complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5c472f8066a2430d37e23f0c29c45718',1,'std::operator-(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9fb72f354a48fc4332fed44a47c562fd',1,'std::operator-(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga526ecc839bcebb2dbb970cee1d3de8d3',1,'std::operator-(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga9098fadcbe59e0ba2fa8590bd8388f5e',1,'std::tr2::operator-()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaab018c47cc4e8f0dfa471622a784677b',1,'operator-(const complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5c472f8066a2430d37e23f0c29c45718',1,'operator-(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9fb72f354a48fc4332fed44a47c562fd',1,'operator-(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga526ecc839bcebb2dbb970cee1d3de8d3',1,'operator-(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga9098fadcbe59e0ba2fa8590bd8388f5e',1,'operator-(const dynamic_bitset< _WordT, _Alloc > &__x, const dynamic_bitset< _WordT, _Alloc > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga028b49a6d0cf1f6afa48149603d953b2',1,'operator-() const(Global Namespace)']]], + ['operator_2d_2d_318',['operator--',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a792a43266d40b85aca7fd5ccce99a689',1,'cv::MatConstIterator::operator--()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a9ebb7e43682a724ce28d8715fc29a783',1,'cv::MatConstIterator::operator--(int)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#acd66a482fbc19586f2dfd47ebba6b448',1,'cv::MatConstIterator_::operator--()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ab07d8d0b89c903f779a021c2c97c8420',1,'cv::MatConstIterator_::operator--(int)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a7882f8680fe5a579a8cff9e77b876e34',1,'cv::MatIterator_::operator--()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#aacbd0bc9e0eccb76169a7bc3188527ad',1,'cv::MatIterator_::operator--(int)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a240e65582faf3f08a0cc9268063efdf0',1,'cv::SparseMatConstIterator::operator--()'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ae1e53a3cb951f9c3647c18e160fa124f',1,'cv::SparseMatConstIterator::operator--(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a013970df0401622fc82f1e3b4aafeb73',1,'std::reverse_iterator::operator--()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#ac7ab8ae9e2d74a1456d6d835e3de74e5',1,'std::reverse_iterator::operator--(int)']]], + ['operator_2d_3d_319',['operator-=',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a881e7011fee862380940bef019551dc6',1,'cv::MatConstIterator::operator-=()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#af05c490f19f8e10d3d81c7697e007e98',1,'cv::MatConstIterator_::operator-=()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ad0d1fe9aba83851f42462de9365268a2',1,'cv::MatIterator_::operator-=()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'cv::Matx::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'cv::Matx::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< _Tp, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< _Tp, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 1, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 1, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 2 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 2 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float_type, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float_type, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga27579376dfdbd8e4ffcdb7b3f0b7efe8',1,'cv::softdouble::operator-=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga855ef9ba871cb9fb4c2f7034966af711',1,'cv::softfloat::operator-=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'cv::Vec::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'cv::Vec::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< _Tp, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< _Tp, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a6e9d5332bf641e4bebfc4d94b407bfd0',1,'std::complex::operator-=(const _Tp &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaacea589517bdac6f85963e345f09ee17',1,'std::complex::operator-=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#af98737e3474e12ecb9d40f19bea2ea9e',1,'std::fpos::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac25a53dfa03677767990c5a3af186cf8',1,'std::gslice_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8eb0f010a6a61d5066af1b3e757b87b9',1,'std::indirect_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7e8b4e636a4ccb6a93f289308d2d6c7e',1,'std::mask_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a194e833ea2d84161f1bf3f996d1d1d5f',1,'std::reverse_iterator::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaaa8967e72a60fc2b6f8f422dc970ea1f',1,'std::slice_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a821d3b176095151a3557a0aa6f7871e4',1,'std::tr2::dynamic_bitset::operator-=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a821d3b176095151a3557a0aa6f7871e4',1,'std::tr2::dynamic_bitset::operator-=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4667f35667105d1ec1aa3e763c503cd4',1,'std::valarray::operator-=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e7ec75f9c2dd61177a35d939ce85f11',1,'std::valarray::operator-=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4667f35667105d1ec1aa3e763c503cd4',1,'valarray< size_t >::operator-=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e7ec75f9c2dd61177a35d939ce85f11',1,'valarray< size_t >::operator-=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#aac76a5e5e735b97f955189825cef7e2c',1,'Eigen::ArrayBase::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#aac76a5e5e735b97f955189825cef7e2c',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1042124b0ddee66e78ac7b0a9ac4cc9c',1,'Eigen::MatrixBase::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1042124b0ddee66e78ac7b0a9ac4cc9c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1042124b0ddee66e78ac7b0a9ac4cc9c',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a79ff0326cd78da5bb2bdc4a88f5428c9',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'Eigen::VectorwiseOp::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Derived, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Derived, Vertical >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator-=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gad5ad464e467385af9b4183e1689fa720',1,'cv::operator-=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga855ef9ba871cb9fb4c2f7034966af711',1,'operator-=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga27579376dfdbd8e4ffcdb7b3f0b7efe8',1,'operator-=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gad5ad464e467385af9b4183e1689fa720',1,'operator-=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaacea589517bdac6f85963e345f09ee17',1,'operator-=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac25a53dfa03677767990c5a3af186cf8',1,'operator-=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4667f35667105d1ec1aa3e763c503cd4',1,'operator-=(const _Tp &)(Global Namespace)']]], + ['operator_2d_3e_320',['operator->',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#af9c384816f316388b844f764d50c5ef7',1,'cv::util::optional::operator->()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a656e8f03c9c93365ad168cc141682658',1,'cv::util::optional::operator->() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#afff5687d9255ad33daa6780dda27b6c5',1,'__gnu_debug::_Safe_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a4789f11d5d5c248e478a79f590186f1a',1,'__gnu_debug::_Safe_local_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a60137368e9df33aaca43271c842f0dea',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a60137368e9df33aaca43271c842f0dea',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a2096ba7f4be3c22e0f883172ba323f5c',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a2096ba7f4be3c22e0f883172ba323f5c',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#afff5687d9255ad33daa6780dda27b6c5',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#afff5687d9255ad33daa6780dda27b6c5',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a4f35a84ace173bc8b49e7b15af544bdc',1,'const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#ab0ed1f338073d1926501cc11769724d9',1,'iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a4f35a84ace173bc8b49e7b15af544bdc',1,'point_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a281f49eca5033b2d2bd3c5f369bdb9e0',1,'point_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a26129c2150ef03c1d8d33a3bbe65ef23',1,'std::auto_ptr::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#acff5a9bfb1ef4383f413ea2cc8f6ef7d',1,'std::regex_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#aec95fbb6d9ff5cca02e86c2f8bdd3de9',1,'std::regex_token_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#ab256f3da0cdc3212fd9f676e70fcfa74',1,'std::reverse_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'std::unique_ptr::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Codecvt >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Res_type >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Result< _Res > >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Result_base >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< bool[]>::operator->()']]], + ['operator_2f_321',['operator/',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4fd7c94c36187ae1dd810e5e1cb98506',1,'cv::MatExpr::operator/(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9f4860191ebc911882258adb3ed81220',1,'cv::MatExpr::operator/(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7d490d89368ae09a8034d3ef145f1b75',1,'cv::MatExpr::operator/(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6f76b7cbb9b728896ffb90522796a1c7',1,'cv::MatExpr::operator/(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27472a7b10eb061860f2d44e91ce2016',1,'cv::MatExpr::operator/(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aa27acc5fc0baa71648720825da8d7c8d',1,'cv::MatExpr::operator/(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af1c42ad483f7b6947e17db0c508c4292',1,'cv::MatExpr::operator/(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a296be1bafb9c82f8fd4ec55ea5f3ef81',1,'cv::MatExpr::operator/(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af0227aa2a8b2fb11495e9efc2ce8a9b6',1,'cv::MatExpr::operator/(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a86f61f74c4c8c305218ab7f6e1ad7f87',1,'cv::MatExpr::operator/(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4fd7c94c36187ae1dd810e5e1cb98506',1,'cv::MatExpr::operator/(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9f4860191ebc911882258adb3ed81220',1,'cv::MatExpr::operator/(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7d490d89368ae09a8034d3ef145f1b75',1,'cv::MatExpr::operator/(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6f76b7cbb9b728896ffb90522796a1c7',1,'cv::MatExpr::operator/(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27472a7b10eb061860f2d44e91ce2016',1,'cv::MatExpr::operator/(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aa27acc5fc0baa71648720825da8d7c8d',1,'cv::MatExpr::operator/(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af1c42ad483f7b6947e17db0c508c4292',1,'cv::MatExpr::operator/(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a296be1bafb9c82f8fd4ec55ea5f3ef81',1,'cv::MatExpr::operator/(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af0227aa2a8b2fb11495e9efc2ce8a9b6',1,'cv::MatExpr::operator/(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a86f61f74c4c8c305218ab7f6e1ad7f87',1,'cv::MatExpr::operator/(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga995d0eb099efa09893b36adecda4243a',1,'cv::softdouble::operator/()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaad5d6d10fa57557f159b67b9618bf557',1,'cv::softfloat::operator/()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'Eigen::VectorwiseOp::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Derived, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Derived, Vertical >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator/()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a90a11fe6c7f37b1746a3ff9cb24b0d53.html#a90a11fe6c7f37b1746a3ff9cb24b0d53',1,'nlohmann::json_pointer::operator/'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_af5a4bc4f82113c271c9a0cd4d3b5f31c.html#af5a4bc4f82113c271c9a0cd4d3b5f31c',1,'nlohmann::json_pointer::operator/'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a926c9065dbed1bedc17857a813f7a46f.html#a926c9065dbed1bedc17857a813f7a46f',1,'nlohmann::json_pointer::operator/'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga73e22cc4b1f8a3132abc30677ed531c4',1,'cv::operator/()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63c10edfae5414877b679eeb58c9f4a7',1,'cv::cudev::operator/(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2abad8ee149156b1c5538b6fc541638',1,'cv::cudev::operator/(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1a1c4ccd594dd41d946649a7ab1ca3',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfba9463c82a223ac76103d9bcf16aa0',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1782e839b0d1c68438dbecfcac2820ac',1,'cv::cudev::operator/(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabaec01b86941bbff223af9d2c29e68bc',1,'cv::cudev::operator/(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0f36028b3f87632fbadae1cf5f2d03',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8314510e1d4316367ac391f110059454',1,'cv::cudev::operator/(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9036097b144dbf93817c5ef126d116d0',1,'cv::cudev::operator/(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8db65d14cd813f8d457b921c39bb27a8',1,'cv::cudev::operator/(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c6b1c78bd2dbea3ea062235736e7329',1,'cv::cudev::operator/(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d4687efb816dcbc5a403deef46acdb',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3bfcae1affcdf5e57f963f93722a04c3',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa73d74035bcb8e99515b0e082068845',1,'cv::cudev::operator/(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26c9c7aac034c3c77d2c7fcafb2b7324',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b20a16f030f203ca1246b182ee58fd5',1,'cv::cudev::operator/(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89c3f0a954a006a68c412300414e17de',1,'cv::cudev::operator/(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520991356f52a0254059d9542c16006',1,'cv::cudev::operator/(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ef2415aa67752f6a252d4f7d068a526',1,'cv::cudev::operator/(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68da45fdf82b957dbb2cf14a027c0322',1,'cv::cudev::operator/(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67a4465bc93192a57e10555bccc96bda',1,'cv::cudev::operator/(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga906b0deabff7997bb4d80ae166a137c3',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a7b51f10d165feaae86cd0bc18e91e1',1,'cv::cudev::operator/(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a6cbf801c763c54dbd07832815194bd',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52e5285f48a908e86ff891aed2d743f2',1,'cv::cudev::operator/(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a2a30fd3e15d27a99f3b7d1917f9e38',1,'cv::cudev::operator/(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga624a50622e8a386f768ef3190ef08ba8',1,'cv::cudev::operator/(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac63ba9fe41878226447c261efbb516c1',1,'cv::cudev::operator/(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga436022693ffe3e23663fa33b1512e777',1,'cv::cudev::operator/(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5877c60845ecd0eb7145b119e6513b55',1,'cv::cudev::operator/(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ef3fffb48e92a7a50f3851c5fb7338b',1,'cv::cudev::operator/(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad520b1c01bd7118c82548f6cb020238f',1,'cv::cudev::operator/(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae93cb2fb69f84957b45190513bc4ac38',1,'cv::cudev::operator/(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadff98c44d9758083f04c7eee4e7d5a3e',1,'cv::cudev::operator/(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga549d0f141917aec8ef972c77971c1084',1,'cv::cudev::operator/(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508053e4393ce90846ce4974907d317a',1,'cv::cudev::operator/(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga583198460ba33f63a71a030fb51ea4ec',1,'cv::cudev::operator/(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a8182f4c0412f05ec96d4f734619f65',1,'cv::cudev::operator/(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae209c1b38d254292bf2ff0ca617d96bd',1,'cv::cudev::operator/(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7ce642e9cb3aad8237b74e57545ec0',1,'cv::cudev::operator/(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc358c56da85f1e9fb45ec4379aef819',1,'cv::cudev::operator/(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37633241bee5b78408d690bea4d6bc97',1,'cv::cudev::operator/(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182216df7f15de3724ac89de6dbbdc08',1,'cv::cudev::operator/(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24d234d3496e5365fcc0181c864bee8f',1,'cv::cudev::operator/(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84226e77b868bda78abaa855e431f83b',1,'cv::cudev::operator/(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5065b677cee6eaf61c4990fab2fef59b',1,'cv::cudev::operator/(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45b4e9375b6e30685cc40474d84ccf02',1,'cv::cudev::operator/(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2025f63f3d90e41dec633bedd58357e',1,'cv::cudev::operator/(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86d40a00cbb232d5d72ba19ec81ed438',1,'cv::cudev::operator/(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc622e639c83e90f061aea4d908af53',1,'cv::cudev::operator/(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8126bd6f60da8d7fcb39cb6abd253bdc',1,'cv::cudev::operator/(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae06070c3075afe5424512508edb81586',1,'cv::cudev::operator/(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga460f926abfd82d2b3f91e886ee6d6aa4',1,'cv::cudev::operator/(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19e6a6945b5af142801ced01b619f993',1,'cv::cudev::operator/(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaade20eaaba20908f19ea46982534d36f',1,'cv::cudev::operator/(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d97c6ab31477097c28510e7b449979f',1,'cv::cudev::operator/(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07c8153666fa828bf51ba1df3d037641',1,'cv::cudev::operator/(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace9317803db502fe7a302c33e81fde41',1,'cv::cudev::operator/(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04b6dbca2658111aa32e4b32f88e3d29',1,'cv::cudev::operator/(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb7d476559b303db2472d6effecb2f89',1,'cv::cudev::operator/(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab32e30453cfc72ff1b0aa78c8a1b2d',1,'cv::cudev::operator/(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfda695bfc877ea25dbf96d5b554676',1,'cv::cudev::operator/(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3addc09f491a734516e0b7dd2b44179',1,'cv::cudev::operator/(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a4539fab45842a06a5edecc85beb00',1,'cv::cudev::operator/(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad727324599c518090bdfccf7b8e08c22',1,'cv::cudev::operator/(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5db301a86ed3528e1ae4d332a6f30fd2',1,'cv::cudev::operator/(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53358badb500dfd70e070cf1ebfd0a18',1,'cv::cudev::operator/(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56dffbd26015a50c0bc5aa6ebb742c31',1,'cv::cudev::operator/(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac92b8e55ec04f04b2c031123d997c266',1,'cv::cudev::operator/(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987dcefef0b62d8bc37af554235fe0ef',1,'cv::cudev::operator/(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab67eafd771d2282a502fdbd6c54ead06',1,'cv::cudev::operator/(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ab843a5f0b70aad934d6c3e5c5b8257',1,'cv::cudev::operator/(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga947ed5817156d062129c8903c0603e95',1,'cv::cudev::operator/(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5eed4cb9d49becaa49611f544539d206',1,'cv::cudev::operator/(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05241f798415de42c5da5c69c55aef11',1,'cv::cudev::operator/(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf24592373ca8cb6278d42bd53e8184a',1,'cv::cudev::operator/(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99f77817f5ca8058516194a9dd63c283',1,'cv::cudev::operator/(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed1bde145568955c9f1131d91a4e0614',1,'cv::cudev::operator/(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cc5fea7eec39d991a9bca1c5d65f450',1,'cv::cudev::operator/(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2564bcebc93bb19ad1ef13ad520ed4d',1,'cv::cudev::operator/(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6829aff16fde91d0e7465d0fb6e62913',1,'cv::cudev::operator/(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50208cff6a446a4b35ac2f8688eebce0',1,'cv::cudev::operator/(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa97fbcd1bc2ad1f58b02b567645c9d61',1,'cv::cudev::operator/(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga816379a4f078d68b1c4c351dad009189',1,'cv::cudev::operator/(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabef9e42d02bba8884bfad5fbe70bbada',1,'cv::cudev::operator/(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17a0b78772e84b3e73b6890b49d340e1',1,'cv::cudev::operator/(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga794491c37dd2df850f3893138414353a',1,'cv::cudev::operator/(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b08fc0b7dbd5277deb26cdc85008b2d',1,'cv::cudev::operator/(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b04679db179bda54f1e9d0d2673ffc4',1,'cv::cudev::operator/(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8034cd977168fcbeb64d0f143c27dd6c',1,'cv::cudev::operator/(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad760f8b985f9f78e6f7cfae125c57952',1,'cv::cudev::operator/(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab37aec5734a505aa76159bb43f68a636',1,'cv::cudev::operator/(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c116242125c2ea7d6aaef804c309757',1,'cv::cudev::operator/(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ba61529ddd1ed3f0329c56b834999a1',1,'cv::cudev::operator/(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga113d7371aab51f681e1e5e82d268c3ee',1,'cv::cudev::operator/(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65207a98a6ba24f91f6d735a88c4ae11',1,'cv::cudev::operator/(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4cab124d95ea36b40f41915cb6c52e',1,'cv::cudev::operator/(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c0325622303ec37f5a35fdb5acb4aba',1,'cv::cudev::operator/(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51668d8071ec45f300736c84386a95de',1,'cv::cudev::operator/(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ba06691317169f995b1e4f84af326f',1,'cv::cudev::operator/(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cd026898af4d75be94752d39ea86285',1,'cv::cudev::operator/(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f6d00516b5705d5b0bfe98574781f29',1,'cv::cudev::operator/(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf2e26c94589161b5aa1ff904b3d91c1',1,'cv::cudev::operator/(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1fd8b99c66de2ff572d583fd379f9a3',1,'cv::cudev::operator/(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga941fdc20547d924ada48cfb0e59957c2',1,'cv::cudev::operator/(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147f7c5b249d5eec2f5edbe9d663f023',1,'cv::cudev::operator/(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a2f63e1448c1423a462cb3802dbc1fc',1,'cv::cudev::operator/(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f9f5d4955d4910a88edc28d264773a',1,'cv::cudev::operator/(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788722f37dc7eedf7369be91a27b2baf',1,'cv::cudev::operator/(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0784968a2beace1b43d5bfcad6895bf8',1,'cv::cudev::operator/(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4107f0212b5bd97903dbc0fd113a55bd',1,'cv::cudev::operator/(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f7aee12ad93a7ddeb22a39e77fbb649',1,'cv::cudev::operator/(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86164b5b800cbf1a1bc1da69dc6b1cea',1,'cv::cudev::operator/(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffb8f750584cbf3428cca25579fa9e0e',1,'cv::cudev::operator/(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddffd612d0a062ab2c7c63f809d32103',1,'cv::cudev::operator/(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8efa47e085c080af09f59676bce38003',1,'cv::cudev::operator/(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3701eb47de8686f78f358575ee69eab',1,'cv::cudev::operator/(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4996cdd2cf5b7d7f88201b3280b9b882',1,'cv::cudev::operator/(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efd1425a4f37f08505df7138be39786',1,'cv::cudev::operator/(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb65bc0269df370c51277a668fcdcc73',1,'cv::cudev::operator/(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa92a62d328a8ab3e85e80b52693d156c',1,'cv::cudev::operator/(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72f5c3ec2dbedb3f1150559435cb430b',1,'cv::cudev::operator/(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391153a0840528f075a6fc407e841c10',1,'cv::cudev::operator/(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadeb192837562e5c4b8d82f8ab38bf084',1,'cv::cudev::operator/(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2f238b633143c3e6b22b2b8579c53e',1,'cv::cudev::operator/(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f1ef76972820abe1d3a3ae91e95de4',1,'cv::cudev::operator/(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15fa7ad89e9bafc4993276448a0d3bd5',1,'cv::cudev::operator/(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab15f13356b2c04e4c2c4cebdcf6e4b',1,'cv::cudev::operator/(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafae9c481f30b10a2c900bf4a4da08af8',1,'cv::cudev::operator/(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7ca775d4ec4865729ecdc345dab1e30',1,'cv::cudev::operator/(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade1df8d73b8ac8fb3fd2fb853a0c187a',1,'cv::cudev::operator/(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe8737c01957c40118140eec1bf68d9',1,'cv::cudev::operator/(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6c52b2d2d236023ea59691301f17cc',1,'cv::cudev::operator/(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8435aa501c96247ea59d3ea8b947117e',1,'cv::cudev::operator/(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga828cee39fcbf51a1644d44510c12b7b4',1,'cv::cudev::operator/(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c5f0b61d269ea3a00f58a1b80b09aa5',1,'cv::cudev::operator/(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94a4aa6688bbf6fb5dbe16962cf49041',1,'cv::cudev::operator/(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ac2bcd0e1c58eabcbba3caa878be93f',1,'cv::cudev::operator/(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fccb24eadfc89075e1380c4a840226d',1,'cv::cudev::operator/(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f329583283b38d835e5111baa0e9ccb',1,'cv::cudev::operator/(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac224098894c2dd93c45d36ce0aa2d8f0',1,'cv::cudev::operator/(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf34d47c8fc399c1b5633a81e0a2a20aa',1,'cv::cudev::operator/(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64c7907250e45a962209e2c4c8e3860d',1,'cv::cudev::operator/(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1db39b81ceb79ce30d5ff502387a0172',1,'cv::cudev::operator/(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e6457d8d8908556e5a6623bca43f0d5',1,'cv::cudev::operator/(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22b5c96ff38d1d48b10aabad0e49be7b',1,'cv::cudev::operator/(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdf50d97f13cd4161262f9f7152c936c',1,'cv::cudev::operator/(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga317fc707d6c32eb0344e606c409cd502',1,'cv::cudev::operator/(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0dd8315bf86df24af59d7a26804f4af3',1,'cv::cudev::operator/(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca9088b2f5335ee8214a1dfbc42fd1d',1,'cv::cudev::operator/(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1aaea7b03c2dff6baf65f0054823b44',1,'cv::cudev::operator/(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49c5598a8d2bcf1957abd74da1c06936',1,'cv::cudev::operator/(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d4fa53f21d88b5d9fa07222b90ee3c',1,'cv::cudev::operator/(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c71abb3cec3af512f67e4b7134f4870',1,'cv::cudev::operator/(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9763eb69ace36e922bdc23adf58fa071',1,'cv::cudev::operator/(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6426caf4d84767c4f4b4df77b4bd8f7',1,'cv::cudev::operator/(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b4c3fadce268d79da7c2e33e1aa8ac',1,'cv::cudev::operator/(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fda9fbfd0224f6806547e77bbc9bbec',1,'cv::cudev::operator/(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c9e4aecc482aeae0ebd4fc37b1efd7',1,'cv::cudev::operator/(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeffd81f4b90d5e1fb4f7d8658d595a73',1,'cv::cudev::operator/(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae885e6e18ed764df65cc712846fbcf82',1,'cv::cudev::operator/(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e271106bb16c64506b78f50599ffad0',1,'cv::cudev::operator/(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2af76884f887a6bae64783d7cfa3fd5',1,'cv::cudev::operator/(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga216608449d27058bfa3427d67089019b',1,'cv::cudev::operator/(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85aa004a5cb3b6108b0041ad11574367',1,'cv::cudev::operator/(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a42711792e9b1ed79c25959954adc',1,'cv::cudev::operator/(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04cb7fa059a6bfa8de34114ccb829475',1,'cv::cudev::operator/(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5c764c78ba7fc0170c586345d67cf82',1,'cv::cudev::operator/(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac28d28065b478079ccf4706cb328ad52',1,'cv::cudev::operator/(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8722a51ca67c9eac25f2896535e5543d',1,'cv::cudev::operator/(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd7e6744dedace2790dda951604c16f4',1,'cv::cudev::operator/(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac20d96aa5d9bc6828f580d98be9b274b',1,'cv::cudev::operator/(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e16dd1de3cc6cdaa3e01b991cf1877',1,'cv::cudev::operator/(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d2ad56cb9b7935755ab98989621744',1,'cv::cudev::operator/(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d36cf520a15e02c4639cf09d13638af',1,'cv::cudev::operator/(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae910a0177b6e5954def12c3e1ceb7889',1,'cv::cudev::operator/(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4b24fae841ff37f46b2f184e4214f49',1,'cv::cudev::operator/(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9fb15ffc426038614898e8cf6f5245',1,'cv::cudev::operator/(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad380b25d2ba11d6de6db82c39052900e',1,'cv::cudev::operator/(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b3207d6bf2685058ea4e895ac25c678',1,'cv::cudev::operator/(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15293a946d5146fd48c04f46b2b81845',1,'cv::cudev::operator/(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca80d86a8a80d0a596b3c5abdc0f5b7',1,'cv::cudev::operator/(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed6a240c984f95a345129f96274a9cfe',1,'cv::cudev::operator/(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9f5801f25493f31c7f636c3df933b99',1,'cv::cudev::operator/(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae74b42fba92a1278d5d20a37ff25668c',1,'cv::cudev::operator/(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21b3dbd89341fa3f444ea21ef6e0b2f5',1,'cv::cudev::operator/(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87509bef25c897cac8532e466e4d66a7',1,'cv::cudev::operator/(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6653c9349dcc4767667164b9c45ecc4f',1,'cv::cudev::operator/(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfbe8b6a853d911c6caa057249a2f3c2',1,'cv::cudev::operator/(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac53ae2c9994299b79543fd5d25284a85',1,'cv::cudev::operator/(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a5e479a1745b53490f2c08b0993c0e5',1,'cv::cudev::operator/(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f5210161d628f2d4e696f26fac33d7',1,'cv::cudev::operator/(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf75713de0f2b797667bb783913812cf5',1,'cv::cudev::operator/(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b57e7742e16dc732c96c86c7a25a7d',1,'cv::cudev::operator/(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53df6d0915ba0492a653459ccb61dd1e',1,'cv::cudev::operator/(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca76e1c82d8c8fa487273dd5488b5afc',1,'cv::cudev::operator/(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff3491be4e1aeb2d4b2ecfafac25bfc',1,'cv::cudev::operator/(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae20c5ffaf5dc093b018dbb2c623a4a9d',1,'cv::cudev::operator/(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga294bb78feefcf2213a99e3765bfcd590',1,'cv::cudev::operator/(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f4874876e654be2d30711f55ba67bb9',1,'cv::cudev::operator/(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931b2f3f4067c776bc79fa993f307479',1,'cv::cudev::operator/(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b00fe8b4c36cb662c4528caced6e021',1,'cv::cudev::operator/(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dd0224214d0591a4644c9fa753c613',1,'cv::cudev::operator/(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d8b0d5eb5f540043139d7077cd89acd',1,'cv::cudev::operator/(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa14eb5e414191a5110c9657940f4911f',1,'cv::cudev::operator/(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845184957965ee09b2c75d19b3c943b8',1,'cv::cudev::operator/(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98436d248883059f3789b0d0ee05623',1,'cv::cudev::operator/(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae36ded72b3f6a63e66bf8e6bedcd1246',1,'cv::cudev::operator/(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f5082bc85c86de08b2e0f479411caec',1,'cv::cudev::operator/(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d17e190d57f7cbaa40be123e2a51224',1,'cv::cudev::operator/(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41a157235e0cf757bb61bdf97c135a56',1,'cv::cudev::operator/(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5738156055f71a2394da2fd9986e73',1,'cv::cudev::operator/(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cbd3ba36dcb1399c0cebe931b575705',1,'cv::cudev::operator/(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71437398c247ffa7ef5ced05aa8c32fd',1,'cv::cudev::operator/(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca86550e3139b130209e6a73f8e288c',1,'cv::cudev::operator/(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a9725a2048b27de8e5b4b7a962b7a45',1,'cv::cudev::operator/(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga263e8628015d84cc51979ad5d9fab4dd',1,'cv::cudev::operator/(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3618b8f1c4483be2b49784692b55da93',1,'cv::cudev::operator/(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56abdc374d21db3f6d3a4750a60b46d4',1,'cv::cudev::operator/(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga964f4c517e631519f06210ca6e00a505',1,'cv::cudev::operator/(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7785eabab48b5412e4bec4c5ff9a221d',1,'cv::cudev::operator/(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga985d99669358177e1081cd19cea4fb7a',1,'cv::cudev::operator/(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ae6065edefcba07b4aab58590e4414',1,'cv::cudev::operator/(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8820b8c1e646e150d78c6c23192d99bc',1,'cv::cudev::operator/(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaad5d6d10fa57557f159b67b9618bf557',1,'operator/(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga995d0eb099efa09893b36adecda4243a',1,'operator/(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga73e22cc4b1f8a3132abc30677ed531c4',1,'operator/(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63c10edfae5414877b679eeb58c9f4a7',1,'operator/(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2abad8ee149156b1c5538b6fc541638',1,'operator/(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1a1c4ccd594dd41d946649a7ab1ca3',1,'operator/(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfba9463c82a223ac76103d9bcf16aa0',1,'operator/(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1782e839b0d1c68438dbecfcac2820ac',1,'operator/(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabaec01b86941bbff223af9d2c29e68bc',1,'operator/(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0f36028b3f87632fbadae1cf5f2d03',1,'operator/(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8314510e1d4316367ac391f110059454',1,'operator/(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9036097b144dbf93817c5ef126d116d0',1,'operator/(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8db65d14cd813f8d457b921c39bb27a8',1,'operator/(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c6b1c78bd2dbea3ea062235736e7329',1,'operator/(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d4687efb816dcbc5a403deef46acdb',1,'operator/(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3bfcae1affcdf5e57f963f93722a04c3',1,'operator/(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa73d74035bcb8e99515b0e082068845',1,'operator/(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26c9c7aac034c3c77d2c7fcafb2b7324',1,'operator/(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b20a16f030f203ca1246b182ee58fd5',1,'operator/(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89c3f0a954a006a68c412300414e17de',1,'operator/(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520991356f52a0254059d9542c16006',1,'operator/(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ef2415aa67752f6a252d4f7d068a526',1,'operator/(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68da45fdf82b957dbb2cf14a027c0322',1,'operator/(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67a4465bc93192a57e10555bccc96bda',1,'operator/(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga906b0deabff7997bb4d80ae166a137c3',1,'operator/(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a7b51f10d165feaae86cd0bc18e91e1',1,'operator/(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a6cbf801c763c54dbd07832815194bd',1,'operator/(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52e5285f48a908e86ff891aed2d743f2',1,'operator/(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a2a30fd3e15d27a99f3b7d1917f9e38',1,'operator/(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga624a50622e8a386f768ef3190ef08ba8',1,'operator/(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac63ba9fe41878226447c261efbb516c1',1,'operator/(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga436022693ffe3e23663fa33b1512e777',1,'operator/(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5877c60845ecd0eb7145b119e6513b55',1,'operator/(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ef3fffb48e92a7a50f3851c5fb7338b',1,'operator/(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad520b1c01bd7118c82548f6cb020238f',1,'operator/(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae93cb2fb69f84957b45190513bc4ac38',1,'operator/(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadff98c44d9758083f04c7eee4e7d5a3e',1,'operator/(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga549d0f141917aec8ef972c77971c1084',1,'operator/(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508053e4393ce90846ce4974907d317a',1,'operator/(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga583198460ba33f63a71a030fb51ea4ec',1,'operator/(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a8182f4c0412f05ec96d4f734619f65',1,'operator/(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae209c1b38d254292bf2ff0ca617d96bd',1,'operator/(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7ce642e9cb3aad8237b74e57545ec0',1,'operator/(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc358c56da85f1e9fb45ec4379aef819',1,'operator/(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37633241bee5b78408d690bea4d6bc97',1,'operator/(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182216df7f15de3724ac89de6dbbdc08',1,'operator/(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24d234d3496e5365fcc0181c864bee8f',1,'operator/(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84226e77b868bda78abaa855e431f83b',1,'operator/(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5065b677cee6eaf61c4990fab2fef59b',1,'operator/(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45b4e9375b6e30685cc40474d84ccf02',1,'operator/(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2025f63f3d90e41dec633bedd58357e',1,'operator/(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86d40a00cbb232d5d72ba19ec81ed438',1,'operator/(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc622e639c83e90f061aea4d908af53',1,'operator/(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8126bd6f60da8d7fcb39cb6abd253bdc',1,'operator/(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae06070c3075afe5424512508edb81586',1,'operator/(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga460f926abfd82d2b3f91e886ee6d6aa4',1,'operator/(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19e6a6945b5af142801ced01b619f993',1,'operator/(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaade20eaaba20908f19ea46982534d36f',1,'operator/(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d97c6ab31477097c28510e7b449979f',1,'operator/(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07c8153666fa828bf51ba1df3d037641',1,'operator/(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace9317803db502fe7a302c33e81fde41',1,'operator/(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04b6dbca2658111aa32e4b32f88e3d29',1,'operator/(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb7d476559b303db2472d6effecb2f89',1,'operator/(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab32e30453cfc72ff1b0aa78c8a1b2d',1,'operator/(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfda695bfc877ea25dbf96d5b554676',1,'operator/(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3addc09f491a734516e0b7dd2b44179',1,'operator/(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a4539fab45842a06a5edecc85beb00',1,'operator/(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad727324599c518090bdfccf7b8e08c22',1,'operator/(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5db301a86ed3528e1ae4d332a6f30fd2',1,'operator/(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53358badb500dfd70e070cf1ebfd0a18',1,'operator/(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56dffbd26015a50c0bc5aa6ebb742c31',1,'operator/(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac92b8e55ec04f04b2c031123d997c266',1,'operator/(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987dcefef0b62d8bc37af554235fe0ef',1,'operator/(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab67eafd771d2282a502fdbd6c54ead06',1,'operator/(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ab843a5f0b70aad934d6c3e5c5b8257',1,'operator/(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga947ed5817156d062129c8903c0603e95',1,'operator/(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5eed4cb9d49becaa49611f544539d206',1,'operator/(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05241f798415de42c5da5c69c55aef11',1,'operator/(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf24592373ca8cb6278d42bd53e8184a',1,'operator/(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99f77817f5ca8058516194a9dd63c283',1,'operator/(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed1bde145568955c9f1131d91a4e0614',1,'operator/(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cc5fea7eec39d991a9bca1c5d65f450',1,'operator/(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2564bcebc93bb19ad1ef13ad520ed4d',1,'operator/(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6829aff16fde91d0e7465d0fb6e62913',1,'operator/(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50208cff6a446a4b35ac2f8688eebce0',1,'operator/(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa97fbcd1bc2ad1f58b02b567645c9d61',1,'operator/(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga816379a4f078d68b1c4c351dad009189',1,'operator/(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabef9e42d02bba8884bfad5fbe70bbada',1,'operator/(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17a0b78772e84b3e73b6890b49d340e1',1,'operator/(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga794491c37dd2df850f3893138414353a',1,'operator/(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b08fc0b7dbd5277deb26cdc85008b2d',1,'operator/(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b04679db179bda54f1e9d0d2673ffc4',1,'operator/(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8034cd977168fcbeb64d0f143c27dd6c',1,'operator/(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad760f8b985f9f78e6f7cfae125c57952',1,'operator/(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab37aec5734a505aa76159bb43f68a636',1,'operator/(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c116242125c2ea7d6aaef804c309757',1,'operator/(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ba61529ddd1ed3f0329c56b834999a1',1,'operator/(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga113d7371aab51f681e1e5e82d268c3ee',1,'operator/(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65207a98a6ba24f91f6d735a88c4ae11',1,'operator/(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4cab124d95ea36b40f41915cb6c52e',1,'operator/(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c0325622303ec37f5a35fdb5acb4aba',1,'operator/(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51668d8071ec45f300736c84386a95de',1,'operator/(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ba06691317169f995b1e4f84af326f',1,'operator/(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cd026898af4d75be94752d39ea86285',1,'operator/(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f6d00516b5705d5b0bfe98574781f29',1,'operator/(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf2e26c94589161b5aa1ff904b3d91c1',1,'operator/(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1fd8b99c66de2ff572d583fd379f9a3',1,'operator/(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga941fdc20547d924ada48cfb0e59957c2',1,'operator/(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147f7c5b249d5eec2f5edbe9d663f023',1,'operator/(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a2f63e1448c1423a462cb3802dbc1fc',1,'operator/(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f9f5d4955d4910a88edc28d264773a',1,'operator/(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788722f37dc7eedf7369be91a27b2baf',1,'operator/(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0784968a2beace1b43d5bfcad6895bf8',1,'operator/(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4107f0212b5bd97903dbc0fd113a55bd',1,'operator/(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f7aee12ad93a7ddeb22a39e77fbb649',1,'operator/(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86164b5b800cbf1a1bc1da69dc6b1cea',1,'operator/(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffb8f750584cbf3428cca25579fa9e0e',1,'operator/(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddffd612d0a062ab2c7c63f809d32103',1,'operator/(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8efa47e085c080af09f59676bce38003',1,'operator/(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3701eb47de8686f78f358575ee69eab',1,'operator/(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4996cdd2cf5b7d7f88201b3280b9b882',1,'operator/(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efd1425a4f37f08505df7138be39786',1,'operator/(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb65bc0269df370c51277a668fcdcc73',1,'operator/(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa92a62d328a8ab3e85e80b52693d156c',1,'operator/(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72f5c3ec2dbedb3f1150559435cb430b',1,'operator/(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391153a0840528f075a6fc407e841c10',1,'operator/(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadeb192837562e5c4b8d82f8ab38bf084',1,'operator/(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2f238b633143c3e6b22b2b8579c53e',1,'operator/(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f1ef76972820abe1d3a3ae91e95de4',1,'operator/(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15fa7ad89e9bafc4993276448a0d3bd5',1,'operator/(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab15f13356b2c04e4c2c4cebdcf6e4b',1,'operator/(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafae9c481f30b10a2c900bf4a4da08af8',1,'operator/(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7ca775d4ec4865729ecdc345dab1e30',1,'operator/(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade1df8d73b8ac8fb3fd2fb853a0c187a',1,'operator/(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe8737c01957c40118140eec1bf68d9',1,'operator/(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6c52b2d2d236023ea59691301f17cc',1,'operator/(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8435aa501c96247ea59d3ea8b947117e',1,'operator/(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga828cee39fcbf51a1644d44510c12b7b4',1,'operator/(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c5f0b61d269ea3a00f58a1b80b09aa5',1,'operator/(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94a4aa6688bbf6fb5dbe16962cf49041',1,'operator/(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ac2bcd0e1c58eabcbba3caa878be93f',1,'operator/(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fccb24eadfc89075e1380c4a840226d',1,'operator/(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f329583283b38d835e5111baa0e9ccb',1,'operator/(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac224098894c2dd93c45d36ce0aa2d8f0',1,'operator/(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf34d47c8fc399c1b5633a81e0a2a20aa',1,'operator/(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64c7907250e45a962209e2c4c8e3860d',1,'operator/(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1db39b81ceb79ce30d5ff502387a0172',1,'operator/(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e6457d8d8908556e5a6623bca43f0d5',1,'operator/(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22b5c96ff38d1d48b10aabad0e49be7b',1,'operator/(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdf50d97f13cd4161262f9f7152c936c',1,'operator/(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga317fc707d6c32eb0344e606c409cd502',1,'operator/(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0dd8315bf86df24af59d7a26804f4af3',1,'operator/(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca9088b2f5335ee8214a1dfbc42fd1d',1,'operator/(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1aaea7b03c2dff6baf65f0054823b44',1,'operator/(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49c5598a8d2bcf1957abd74da1c06936',1,'operator/(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d4fa53f21d88b5d9fa07222b90ee3c',1,'operator/(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c71abb3cec3af512f67e4b7134f4870',1,'operator/(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9763eb69ace36e922bdc23adf58fa071',1,'operator/(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6426caf4d84767c4f4b4df77b4bd8f7',1,'operator/(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b4c3fadce268d79da7c2e33e1aa8ac',1,'operator/(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fda9fbfd0224f6806547e77bbc9bbec',1,'operator/(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c9e4aecc482aeae0ebd4fc37b1efd7',1,'operator/(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeffd81f4b90d5e1fb4f7d8658d595a73',1,'operator/(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae885e6e18ed764df65cc712846fbcf82',1,'operator/(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e271106bb16c64506b78f50599ffad0',1,'operator/(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2af76884f887a6bae64783d7cfa3fd5',1,'operator/(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga216608449d27058bfa3427d67089019b',1,'operator/(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85aa004a5cb3b6108b0041ad11574367',1,'operator/(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a42711792e9b1ed79c25959954adc',1,'operator/(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04cb7fa059a6bfa8de34114ccb829475',1,'operator/(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5c764c78ba7fc0170c586345d67cf82',1,'operator/(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac28d28065b478079ccf4706cb328ad52',1,'operator/(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8722a51ca67c9eac25f2896535e5543d',1,'operator/(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd7e6744dedace2790dda951604c16f4',1,'operator/(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac20d96aa5d9bc6828f580d98be9b274b',1,'operator/(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e16dd1de3cc6cdaa3e01b991cf1877',1,'operator/(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d2ad56cb9b7935755ab98989621744',1,'operator/(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d36cf520a15e02c4639cf09d13638af',1,'operator/(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae910a0177b6e5954def12c3e1ceb7889',1,'operator/(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4b24fae841ff37f46b2f184e4214f49',1,'operator/(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9fb15ffc426038614898e8cf6f5245',1,'operator/(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad380b25d2ba11d6de6db82c39052900e',1,'operator/(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b3207d6bf2685058ea4e895ac25c678',1,'operator/(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15293a946d5146fd48c04f46b2b81845',1,'operator/(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca80d86a8a80d0a596b3c5abdc0f5b7',1,'operator/(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed6a240c984f95a345129f96274a9cfe',1,'operator/(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9f5801f25493f31c7f636c3df933b99',1,'operator/(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae74b42fba92a1278d5d20a37ff25668c',1,'operator/(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21b3dbd89341fa3f444ea21ef6e0b2f5',1,'operator/(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87509bef25c897cac8532e466e4d66a7',1,'operator/(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6653c9349dcc4767667164b9c45ecc4f',1,'operator/(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfbe8b6a853d911c6caa057249a2f3c2',1,'operator/(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac53ae2c9994299b79543fd5d25284a85',1,'operator/(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a5e479a1745b53490f2c08b0993c0e5',1,'operator/(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f5210161d628f2d4e696f26fac33d7',1,'operator/(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf75713de0f2b797667bb783913812cf5',1,'operator/(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b57e7742e16dc732c96c86c7a25a7d',1,'operator/(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53df6d0915ba0492a653459ccb61dd1e',1,'operator/(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca76e1c82d8c8fa487273dd5488b5afc',1,'operator/(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff3491be4e1aeb2d4b2ecfafac25bfc',1,'operator/(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae20c5ffaf5dc093b018dbb2c623a4a9d',1,'operator/(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga294bb78feefcf2213a99e3765bfcd590',1,'operator/(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f4874876e654be2d30711f55ba67bb9',1,'operator/(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931b2f3f4067c776bc79fa993f307479',1,'operator/(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b00fe8b4c36cb662c4528caced6e021',1,'operator/(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dd0224214d0591a4644c9fa753c613',1,'operator/(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d8b0d5eb5f540043139d7077cd89acd',1,'operator/(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa14eb5e414191a5110c9657940f4911f',1,'operator/(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845184957965ee09b2c75d19b3c943b8',1,'operator/(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98436d248883059f3789b0d0ee05623',1,'operator/(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae36ded72b3f6a63e66bf8e6bedcd1246',1,'operator/(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f5082bc85c86de08b2e0f479411caec',1,'operator/(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d17e190d57f7cbaa40be123e2a51224',1,'operator/(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41a157235e0cf757bb61bdf97c135a56',1,'operator/(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5738156055f71a2394da2fd9986e73',1,'operator/(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cbd3ba36dcb1399c0cebe931b575705',1,'operator/(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71437398c247ffa7ef5ced05aa8c32fd',1,'operator/(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca86550e3139b130209e6a73f8e288c',1,'operator/(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a9725a2048b27de8e5b4b7a962b7a45',1,'operator/(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga263e8628015d84cc51979ad5d9fab4dd',1,'operator/(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3618b8f1c4483be2b49784692b55da93',1,'operator/(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56abdc374d21db3f6d3a4750a60b46d4',1,'operator/(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga964f4c517e631519f06210ca6e00a505',1,'operator/(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7785eabab48b5412e4bec4c5ff9a221d',1,'operator/(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga985d99669358177e1081cd19cea4fb7a',1,'operator/(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ae6065edefcba07b4aab58590e4414',1,'operator/(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8820b8c1e646e150d78c6c23192d99bc',1,'operator/(const double2 &a, double s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga799ec0a9990b63bb54278d14b70b2d83',1,'std::operator/(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gace8f383fa21a65396e93711d963de127',1,'std::operator/(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9e32bc55ff4c92d724b1398241026af5',1,'std::operator/(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga799ec0a9990b63bb54278d14b70b2d83',1,'operator/(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gace8f383fa21a65396e93711d963de127',1,'operator/(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9e32bc55ff4c92d724b1398241026af5',1,'operator/(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)']]], + ['operator_2f_3d_322',['operator/=',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga0ee49b20d55c5902617e381807acb5bf',1,'cv::softdouble::operator/=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga93ae91dcfb3a27c7663a73aca75fd206',1,'cv::softfloat::operator/=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae2defbd37472f207493ea6b8a441899a',1,'std::complex::operator/=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga97944829154f734dd4b9df00a2e2820d',1,'std::complex::operator/=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4a86ee20d770ceb9779e865968faa6a7',1,'std::gslice_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2ea239d6f6f027caa976efe4821944d0',1,'std::indirect_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac1417dfc58271e6730675e151cd3dd06',1,'std::mask_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaea8c21a277b5dfee1f7f4b09c556259d',1,'std::slice_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15f95c715e3a16e30ff24477ccf4e502',1,'std::valarray::operator/=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4572c21b07ac304ac9d7062d2f5ae160',1,'std::valarray::operator/=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15f95c715e3a16e30ff24477ccf4e502',1,'valarray< size_t >::operator/=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4572c21b07ac304ac9d7062d2f5ae160',1,'valarray< size_t >::operator/=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a1717e11dfe9341e9cfba13140cedddce',1,'Eigen::ArrayBase::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a1717e11dfe9341e9cfba13140cedddce',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#af1b9165f5ab6b57a8305c0dc359adf7c',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'Eigen::VectorwiseOp::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Derived, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Derived, Vertical >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator/=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a7395bd0af29ac23fd3f21543c935cdfa.html#a7395bd0af29ac23fd3f21543c935cdfa',1,'nlohmann::json_pointer::operator/=(const json_pointer &ptr)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a7de51480324eb1c5a89ed552cd699875.html#a7de51480324eb1c5a89ed552cd699875',1,'nlohmann::json_pointer::operator/=(std::size_t array_idx)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_abdd21567b2b1d69329af0f520335e68b.html#abdd21567b2b1d69329af0f520335e68b',1,'nlohmann::json_pointer::operator/=(std::string token)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga310bc17ff9e6db416c9c633bb61ee868',1,'cv::operator/=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga93ae91dcfb3a27c7663a73aca75fd206',1,'operator/=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga0ee49b20d55c5902617e381807acb5bf',1,'operator/=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga310bc17ff9e6db416c9c633bb61ee868',1,'operator/=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae2defbd37472f207493ea6b8a441899a',1,'operator/=(const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga97944829154f734dd4b9df00a2e2820d',1,'operator/=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4a86ee20d770ceb9779e865968faa6a7',1,'operator/=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15f95c715e3a16e30ff24477ccf4e502',1,'operator/=(const _Tp &)(Global Namespace)']]], + ['operator_3c_323',['operator<',['https://docs.opencv.org/4.2.0/df/da3/structcv_1_1linemod_1_1QuantizedPyramid_1_1Candidate.html#aa07e4d047df342b0f27b19d1827714f5',1,'cv::linemod::QuantizedPyramid::Candidate::operator<()'],['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#a61ebd9532acb52577d28c0dfefbcb660',1,'cv::DMatch::operator<()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ada726685b67ed5fa4432cc30fb854d34',1,'cv::FileNodeIterator::operator<(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ada726685b67ed5fa4432cc30fb854d34',1,'cv::FileNodeIterator::operator<(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html#ae9655069c8161475dd6c1ff504a6c89f',1,'cv::detail::GraphEdge::operator<()'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a1a987ff8d8b29707c7562206e678a4e8',1,'cv::linemod::Match::operator<()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga479ccee369fff799ced2c404cec35be7',1,'cv::stereo::Match::operator<()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8dbe9fe15d257dbb1a566dd5b752b718',1,'cv::MatExpr::operator<(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a200c6a55801095458ffba28d0bc2051f',1,'cv::MatExpr::operator<(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a027193236c695aef28e54acf23cad5ca',1,'cv::MatExpr::operator<(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac8bc126f547c720e5ec31ce26b31f6bd',1,'cv::MatExpr::operator<(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac30c6355f02755419479b1ffaadd5728',1,'cv::MatExpr::operator<(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8dbe9fe15d257dbb1a566dd5b752b718',1,'cv::MatExpr::operator<(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a200c6a55801095458ffba28d0bc2051f',1,'cv::MatExpr::operator<(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a027193236c695aef28e54acf23cad5ca',1,'cv::MatExpr::operator<(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac8bc126f547c720e5ec31ce26b31f6bd',1,'cv::MatExpr::operator<(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac30c6355f02755419479b1ffaadd5728',1,'cv::MatExpr::operator<(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4124a96f9c9f5f9ebdee548914bf7a04',1,'cv::softdouble::operator<()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga86f3dce677d4a2fb357774c872647522',1,'cv::softfloat::operator<()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#a2bf5c5fcb9aba7fef572a48701d84f9d',1,'__gnu_parallel::_GuardedIterator::operator<'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aacd442b66140c764c594ac8ad7dfd5b3.html#aacd442b66140c764c594ac8ad7dfd5b3',1,'nlohmann::basic_json::operator<'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a52907b78829a55473f2548530cf2c1c7.html#a52907b78829a55473f2548530cf2c1c7',1,'nlohmann::basic_json::operator<'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a71f65ff3abee4c140e27ca64fa327973.html#a71f65ff3abee4c140e27ca64fa327973',1,'nlohmann::basic_json::operator<'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga0e974552b8acc15ea6043ec9cb3a2f44',1,'cv::operator<()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga009cbdc2c91163c286b62fd0bda874c4',1,'cv::cudev::operator<(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga720988e66770098270dbf4cba3d0a570',1,'cv::cudev::operator<(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2de2ba6d33f0f4fcdce970163f47fdb',1,'cv::cudev::operator<(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1001ed9d71e36d2d05c7c0226e4b811e',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4360f50f4aa43506746b04131967e37f',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9233091fdc2614e17dc56697f473ffd',1,'cv::cudev::operator<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0fef7f08d2f37ea7d3e7e59dd68eb1',1,'cv::cudev::operator<(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16563b7c88d735d3b93688d49ecca618',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3351ed0be9b2d6c0f30e9fc13ff0c8f2',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3232fcf3bcad7b1bb9e25bc4dc8e8860',1,'cv::cudev::operator<(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8035e6b052b86212b9290f045b49880',1,'cv::cudev::operator<(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0c410fca36f863f7630eb9688527',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa6f80ff4bc920f6653de63d42ed7e4',1,'cv::cudev::operator<(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac87884be3df070c671185a3c337298f5',1,'cv::cudev::operator<(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14bd8d044c4a278d4ba11588f5de7e2',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d75de24d1d9fbceb70565ca0341945',1,'cv::cudev::operator<(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa80300a972f7a420a010418c5deba9ca',1,'cv::cudev::operator<(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2d5efdf0de121487a6c531f99a6aaef',1,'cv::cudev::operator<(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79ac15ae7290ba39734d1aa37b1f072d',1,'cv::cudev::operator<(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2876596449fc6df9b470e3fe7252b0b',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4622e8f2d5fe5c36196f75bf8007b65',1,'cv::cudev::operator<(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9caf802fa8a65f71f42c8dffa60b318e',1,'cv::cudev::operator<(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dcde070edfa0b5575ce1b3ef503a779',1,'cv::cudev::operator<(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4162b25914b86079cf6b5c53a0bf92',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1e0f762ec13a9e0696855d2e83c692',1,'cv::cudev::operator<(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbe24952f097c0d9c6c9a669c9cbc130',1,'cv::cudev::operator<(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d26c2d02ce10ebfb67caca78e3263c2',1,'cv::cudev::operator<(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9f48d27e0dee369fa39239649ff948a',1,'cv::cudev::operator<(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eaf9aa54d8f3da1be1ab7593bc2918d',1,'cv::cudev::operator<(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1984dfdc91c77e0b2c7e3b0a549964d0',1,'cv::cudev::operator<(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee672427c981240174bb011adf7eb2e8',1,'cv::cudev::operator<(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3197e6bd63fe3b34fa21cf628ab4b2',1,'cv::cudev::operator<(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa031b73d86c8be33e09376abc5865c0b',1,'cv::cudev::operator<(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8f7518c0f408bc6b3940a887bd66d98',1,'cv::cudev::operator<(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034332a898ca12ab5055dcf56d144bab',1,'cv::cudev::operator<(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29838c4abfedff62af6e26f3d62f1da3',1,'cv::cudev::operator<(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9955935230b18c47941eb13d110520',1,'cv::cudev::operator<(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf000ab97193855a862d9374ca0413322',1,'cv::cudev::operator<(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82e21f74ab115cb8d8b130ea0aa38de1',1,'cv::cudev::operator<(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29dfd373e87547b2189a785bdd2d2d30',1,'cv::cudev::operator<(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e3ceeaa992b5389d70a970e723ebcb6',1,'cv::cudev::operator<(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47537c956d1de80e0957697c5cfc5807',1,'cv::cudev::operator<(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1be1cc49d4cecd7a5429de37a81150',1,'cv::cudev::operator<(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27ccf7cfaefc9b9bb196d6134d514954',1,'cv::cudev::operator<(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a7cbda5c7b76068d44b423ba3180197',1,'cv::cudev::operator<(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8c2178181fbb679c4b0a9917b037d6',1,'cv::cudev::operator<(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5302aa2958867fbe5d6103d02587c42',1,'cv::cudev::operator<(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5c4b2c41ed0b03aa208217b10ecd153',1,'cv::cudev::operator<(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga273e57446ed81c0483ba887dd3f93acd',1,'cv::cudev::operator<(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga954fbd581d81f4a0f22937b67cf4bd1a',1,'cv::cudev::operator<(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f78c5aa99e7921f2acb3369662ea8',1,'cv::cudev::operator<(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99b41f158893fb62ff2ec68aa59e1fe8',1,'cv::cudev::operator<(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ba0f960fc417bb64c06b91985160306',1,'cv::cudev::operator<(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0fea95e1138b1be0462bfd06d39e21',1,'cv::cudev::operator<(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac69d2269b390083983094fc05522d3e4',1,'cv::cudev::operator<(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga502b1092946623165164f1eb3db5ec13',1,'cv::cudev::operator<(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacbd2df713f63e213f3c935942f8b789d',1,'cv::cudev::operator<(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cd8a0ab74fe1776ba27691cb9dc0bb1',1,'cv::cudev::operator<(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0dfcd65770b6f6f97c624b03b456219',1,'cv::cudev::operator<(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1c5fb881e5d825b65978c18468c2aa',1,'cv::cudev::operator<(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a482c5969940a7c6039aaaa365f1bc2',1,'cv::cudev::operator<(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc2b224af30927d91ccc96465940505',1,'cv::cudev::operator<(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e887a468977d874479b527d09649134',1,'cv::cudev::operator<(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9ee2e0ba4e219c9fd9f181a7a7e7829',1,'cv::cudev::operator<(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace7961c4f78672879296988127017dc7',1,'cv::cudev::operator<(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb96b9fa9eb4cfd5063728a52752c92',1,'cv::cudev::operator<(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20019500f5925231a8e453e066061b56',1,'cv::cudev::operator<(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef934652424e05dd36af802f8f463631',1,'cv::cudev::operator<(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fd192ad18d856a0df0189ac2df19e42',1,'cv::cudev::operator<(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395ea80af7d2745dab132bbdaa9d3894',1,'cv::cudev::operator<(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76bda195f33e2574a6c60450460c5e14',1,'cv::cudev::operator<(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07693623464c75318cf0dc62902993c9',1,'cv::cudev::operator<(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b93fe9997af973d95ce09182e6f83cd',1,'cv::cudev::operator<(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56a8ddd35f97a00f47f1c58174be300d',1,'cv::cudev::operator<(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd969c3c0fae8b79b41eb91e215a0f6c',1,'cv::cudev::operator<(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae23831834eef58d15594a6de775cb097',1,'cv::cudev::operator<(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae335ff1785c5c99e207d81955d320243',1,'cv::cudev::operator<(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587f8bd580b1cbf02d82319eee32cac9',1,'cv::cudev::operator<(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e02a23a9900338a83321e93d6cb849',1,'cv::cudev::operator<(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga123f05595c78e1eb9c5ae4af2df3fedf',1,'cv::cudev::operator<(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b933d7e73b54df55090a05d233e76ed',1,'cv::cudev::operator<(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab81a6520e9c56086d5938319b47f5ee4',1,'cv::cudev::operator<(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52733db0ac977cc46e56471cb549a6f4',1,'cv::cudev::operator<(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24c3d47e3e73e50e6a7c94175a0779a2',1,'cv::cudev::operator<(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga972d5282ac2202923f870ea8bb918140',1,'cv::cudev::operator<(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e4eca8de66ce6c3006c8c83dca5b83e',1,'cv::cudev::operator<(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd9e7ebda1d8aad9ca5b6dca517b019e',1,'cv::cudev::operator<(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf952eaa3fb132711c2f6ba89ebdd98b7',1,'cv::cudev::operator<(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga098db186cca858509dc51d532b5d7564',1,'cv::cudev::operator<(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a1be5b2b49f5e029ec733450ce10fbd',1,'cv::cudev::operator<(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga579e4cccc35c306c9bed75e01586aa9d',1,'cv::cudev::operator<(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfff9bd4dde1a4bb8e90b7c15e3a3bc1',1,'cv::cudev::operator<(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdd8113fc7213a912edfcb42071db45',1,'cv::cudev::operator<(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b13aeb71dbcf00af868786d733cb6b8',1,'cv::cudev::operator<(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga364d06fad2cedd8ea6ead77708f6872a',1,'cv::cudev::operator<(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf19430d38270527b027e367dd8f75374',1,'cv::cudev::operator<(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48f6f225dc0f298b4550e3bee2922237',1,'cv::cudev::operator<(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e9cb1782ba4f252f4bf7faa67e37a9f',1,'cv::cudev::operator<(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94129d6207f24868de8cb10ea14e103',1,'cv::cudev::operator<(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bcaa50d0526305b450eb7388e30e79',1,'cv::cudev::operator<(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41ad1e69567d7b71a7e5d251f5105b9',1,'cv::cudev::operator<(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47873f124d86cc20cc38b12aad2822a7',1,'cv::cudev::operator<(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a12a1d99cffc29b3a5d722a3bc24eb',1,'cv::cudev::operator<(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa774569fab758f87ea2f32da59541701',1,'cv::cudev::operator<(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e852a418f5730b03e7b2cee91cf78f5',1,'cv::cudev::operator<(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bc4c0b02d2261a0a8f073ea42012509',1,'cv::cudev::operator<(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac42d55945bb2f549eac6b422d70134e9',1,'cv::cudev::operator<(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b8bf0a9ddf12f5978fa840bbb1281c1',1,'cv::cudev::operator<(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe6f82b9b2d38747c4d07bdd384d344',1,'cv::cudev::operator<(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05d714d19bf702199d8bd7e008d8549c',1,'cv::cudev::operator<(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54d0a4a5dc2a8b97726c52d724cd7de4',1,'cv::cudev::operator<(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9d3a1bb44b76d738543a582e2178ebb',1,'cv::cudev::operator<(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3355798174802823946fd7d843d11e6e',1,'cv::cudev::operator<(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572769430e10effec5056d6df7efa16c',1,'cv::cudev::operator<(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ad33b110711b4827718cfef458d5ed7',1,'cv::cudev::operator<(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac72dfaedbb3a827ed78228af321574a1',1,'cv::cudev::operator<(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75730e1d5cede97eb4faf4f1bd833227',1,'cv::cudev::operator<(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e43019fba0109832ea5b5f74e1e92ff',1,'cv::cudev::operator<(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac46443ae5909e3a5066c06f208610caf',1,'cv::cudev::operator<(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae85889915d683c12e077cb4ec5083c2e',1,'cv::cudev::operator<(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga86f3dce677d4a2fb357774c872647522',1,'operator<(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4124a96f9c9f5f9ebdee548914bf7a04',1,'operator<(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga0e974552b8acc15ea6043ec9cb3a2f44',1,'operator<(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga009cbdc2c91163c286b62fd0bda874c4',1,'operator<(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga720988e66770098270dbf4cba3d0a570',1,'operator<(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2de2ba6d33f0f4fcdce970163f47fdb',1,'operator<(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1001ed9d71e36d2d05c7c0226e4b811e',1,'operator<(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4360f50f4aa43506746b04131967e37f',1,'operator<(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9233091fdc2614e17dc56697f473ffd',1,'operator<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0fef7f08d2f37ea7d3e7e59dd68eb1',1,'operator<(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16563b7c88d735d3b93688d49ecca618',1,'operator<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3351ed0be9b2d6c0f30e9fc13ff0c8f2',1,'operator<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3232fcf3bcad7b1bb9e25bc4dc8e8860',1,'operator<(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8035e6b052b86212b9290f045b49880',1,'operator<(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0c410fca36f863f7630eb9688527',1,'operator<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa6f80ff4bc920f6653de63d42ed7e4',1,'operator<(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac87884be3df070c671185a3c337298f5',1,'operator<(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14bd8d044c4a278d4ba11588f5de7e2',1,'operator<(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d75de24d1d9fbceb70565ca0341945',1,'operator<(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa80300a972f7a420a010418c5deba9ca',1,'operator<(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2d5efdf0de121487a6c531f99a6aaef',1,'operator<(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79ac15ae7290ba39734d1aa37b1f072d',1,'operator<(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2876596449fc6df9b470e3fe7252b0b',1,'operator<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4622e8f2d5fe5c36196f75bf8007b65',1,'operator<(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9caf802fa8a65f71f42c8dffa60b318e',1,'operator<(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dcde070edfa0b5575ce1b3ef503a779',1,'operator<(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4162b25914b86079cf6b5c53a0bf92',1,'operator<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1e0f762ec13a9e0696855d2e83c692',1,'operator<(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbe24952f097c0d9c6c9a669c9cbc130',1,'operator<(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d26c2d02ce10ebfb67caca78e3263c2',1,'operator<(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9f48d27e0dee369fa39239649ff948a',1,'operator<(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eaf9aa54d8f3da1be1ab7593bc2918d',1,'operator<(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1984dfdc91c77e0b2c7e3b0a549964d0',1,'operator<(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee672427c981240174bb011adf7eb2e8',1,'operator<(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3197e6bd63fe3b34fa21cf628ab4b2',1,'operator<(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa031b73d86c8be33e09376abc5865c0b',1,'operator<(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8f7518c0f408bc6b3940a887bd66d98',1,'operator<(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034332a898ca12ab5055dcf56d144bab',1,'operator<(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29838c4abfedff62af6e26f3d62f1da3',1,'operator<(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9955935230b18c47941eb13d110520',1,'operator<(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf000ab97193855a862d9374ca0413322',1,'operator<(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82e21f74ab115cb8d8b130ea0aa38de1',1,'operator<(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29dfd373e87547b2189a785bdd2d2d30',1,'operator<(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e3ceeaa992b5389d70a970e723ebcb6',1,'operator<(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47537c956d1de80e0957697c5cfc5807',1,'operator<(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1be1cc49d4cecd7a5429de37a81150',1,'operator<(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27ccf7cfaefc9b9bb196d6134d514954',1,'operator<(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a7cbda5c7b76068d44b423ba3180197',1,'operator<(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8c2178181fbb679c4b0a9917b037d6',1,'operator<(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5302aa2958867fbe5d6103d02587c42',1,'operator<(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5c4b2c41ed0b03aa208217b10ecd153',1,'operator<(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga273e57446ed81c0483ba887dd3f93acd',1,'operator<(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga954fbd581d81f4a0f22937b67cf4bd1a',1,'operator<(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f78c5aa99e7921f2acb3369662ea8',1,'operator<(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99b41f158893fb62ff2ec68aa59e1fe8',1,'operator<(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ba0f960fc417bb64c06b91985160306',1,'operator<(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0fea95e1138b1be0462bfd06d39e21',1,'operator<(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac69d2269b390083983094fc05522d3e4',1,'operator<(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga502b1092946623165164f1eb3db5ec13',1,'operator<(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacbd2df713f63e213f3c935942f8b789d',1,'operator<(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cd8a0ab74fe1776ba27691cb9dc0bb1',1,'operator<(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0dfcd65770b6f6f97c624b03b456219',1,'operator<(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1c5fb881e5d825b65978c18468c2aa',1,'operator<(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a482c5969940a7c6039aaaa365f1bc2',1,'operator<(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc2b224af30927d91ccc96465940505',1,'operator<(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e887a468977d874479b527d09649134',1,'operator<(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9ee2e0ba4e219c9fd9f181a7a7e7829',1,'operator<(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace7961c4f78672879296988127017dc7',1,'operator<(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb96b9fa9eb4cfd5063728a52752c92',1,'operator<(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20019500f5925231a8e453e066061b56',1,'operator<(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef934652424e05dd36af802f8f463631',1,'operator<(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fd192ad18d856a0df0189ac2df19e42',1,'operator<(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395ea80af7d2745dab132bbdaa9d3894',1,'operator<(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76bda195f33e2574a6c60450460c5e14',1,'operator<(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07693623464c75318cf0dc62902993c9',1,'operator<(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b93fe9997af973d95ce09182e6f83cd',1,'operator<(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56a8ddd35f97a00f47f1c58174be300d',1,'operator<(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd969c3c0fae8b79b41eb91e215a0f6c',1,'operator<(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae23831834eef58d15594a6de775cb097',1,'operator<(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae335ff1785c5c99e207d81955d320243',1,'operator<(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587f8bd580b1cbf02d82319eee32cac9',1,'operator<(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e02a23a9900338a83321e93d6cb849',1,'operator<(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga123f05595c78e1eb9c5ae4af2df3fedf',1,'operator<(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b933d7e73b54df55090a05d233e76ed',1,'operator<(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab81a6520e9c56086d5938319b47f5ee4',1,'operator<(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52733db0ac977cc46e56471cb549a6f4',1,'operator<(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24c3d47e3e73e50e6a7c94175a0779a2',1,'operator<(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga972d5282ac2202923f870ea8bb918140',1,'operator<(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e4eca8de66ce6c3006c8c83dca5b83e',1,'operator<(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd9e7ebda1d8aad9ca5b6dca517b019e',1,'operator<(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf952eaa3fb132711c2f6ba89ebdd98b7',1,'operator<(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga098db186cca858509dc51d532b5d7564',1,'operator<(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a1be5b2b49f5e029ec733450ce10fbd',1,'operator<(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga579e4cccc35c306c9bed75e01586aa9d',1,'operator<(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfff9bd4dde1a4bb8e90b7c15e3a3bc1',1,'operator<(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdd8113fc7213a912edfcb42071db45',1,'operator<(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b13aeb71dbcf00af868786d733cb6b8',1,'operator<(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga364d06fad2cedd8ea6ead77708f6872a',1,'operator<(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf19430d38270527b027e367dd8f75374',1,'operator<(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48f6f225dc0f298b4550e3bee2922237',1,'operator<(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e9cb1782ba4f252f4bf7faa67e37a9f',1,'operator<(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94129d6207f24868de8cb10ea14e103',1,'operator<(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bcaa50d0526305b450eb7388e30e79',1,'operator<(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41ad1e69567d7b71a7e5d251f5105b9',1,'operator<(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47873f124d86cc20cc38b12aad2822a7',1,'operator<(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a12a1d99cffc29b3a5d722a3bc24eb',1,'operator<(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa774569fab758f87ea2f32da59541701',1,'operator<(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e852a418f5730b03e7b2cee91cf78f5',1,'operator<(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bc4c0b02d2261a0a8f073ea42012509',1,'operator<(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac42d55945bb2f549eac6b422d70134e9',1,'operator<(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b8bf0a9ddf12f5978fa840bbb1281c1',1,'operator<(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe6f82b9b2d38747c4d07bdd384d344',1,'operator<(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05d714d19bf702199d8bd7e008d8549c',1,'operator<(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54d0a4a5dc2a8b97726c52d724cd7de4',1,'operator<(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9d3a1bb44b76d738543a582e2178ebb',1,'operator<(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3355798174802823946fd7d843d11e6e',1,'operator<(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572769430e10effec5056d6df7efa16c',1,'operator<(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ad33b110711b4827718cfef458d5ed7',1,'operator<(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac72dfaedbb3a827ed78228af321574a1',1,'operator<(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75730e1d5cede97eb4faf4f1bd833227',1,'operator<(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e43019fba0109832ea5b5f74e1e92ff',1,'operator<(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac46443ae5909e3a5066c06f208610caf',1,'operator<(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae85889915d683c12e077cb4ec5083c2e',1,'operator<(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga479ccee369fff799ced2c404cec35be7',1,'operator<(const Match &rhs) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a322f7449964a51cfe95142e14db0ef72',1,'__gnu_cxx::operator<(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ad7d9e389800dcea7b1748d08f70f0358',1,'__gnu_cxx::operator<(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#afdc865f8e1dd5fb8be54c6a608d6ca17',1,'__gnu_cxx::operator<(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53d215eee36632ee43c5039c54d648ae',1,'std::operator<(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7d32b48a9dc0ee1316aedbde00a1a8fd',1,'std::operator<(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga69e152dbea8e3ca77b307634084fb164',1,'std::operator<(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a203ef17a8b706e78acfa3d05f30e20ca',1,'std::operator<(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7f56f6da4d4f20444cbbab54a95e99e5',1,'std::operator<(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gad9079e03d834c2dfd61dfae4f73f0031',1,'std::operator<(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga341b35e5b4af405e08d5c2abb676cf39',1,'std::operator<(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a64f0c6157f108a5bfe4ac5096e5bc4b2',1,'std::operator<(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20182f0fe24d991ad8a8daede16933fa',1,'std::operator<(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga11e1ee39f1b05e646abe2caea0565967',1,'std::operator<(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga01622c3d750044cf92cd8a1eaa89ca5b',1,'std::operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1862d7e70ac15663db23831edbc4d06f',1,'std::operator<(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5e86344cdca451bac42e9d9936e99353',1,'std::operator<(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a3cbf6143f4ce61b7174408e06a4181f0',1,'std::operator<(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gabc00ef86c05a9226d2007dd587c196f3',1,'std::operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8fcefae1f44d9e5656f2231d04742454',1,'std::operator<(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7b31ae4487ff01fcb215071c0f521caa',1,'std::operator<(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a15c710c3bf507d1a7bdf5f8de40cafe2',1,'std::operator<(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa0eb871a6a5db29c6fa9c682b7808bdd',1,'std::operator<(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a27a4470c800ce13f6c1220c5ec11c360',1,'std::operator<(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5a6f7a1317ae28e6f2b71a0497873e25',1,'std::operator<(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gad9079e03d834c2dfd61dfae4f73f0031',1,'operator<(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga341b35e5b4af405e08d5c2abb676cf39',1,'operator<(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20182f0fe24d991ad8a8daede16933fa',1,'operator<(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga11e1ee39f1b05e646abe2caea0565967',1,'operator<(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga01622c3d750044cf92cd8a1eaa89ca5b',1,'operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1862d7e70ac15663db23831edbc4d06f',1,'operator<(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gabc00ef86c05a9226d2007dd587c196f3',1,'operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga69e152dbea8e3ca77b307634084fb164',1,'operator<(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], + ['operator_3c_3c_324',['operator<<',['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html#acb48faff22c3db55ffa8ea8d1b438983',1,'cv::dnn::Dict::operator<<'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a3e2e82153741f26c1fa03c1b98961006',1,'cv::dnn::DictValue::operator<<'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a5d64e1a22e8e659de99a027f66bf26bc',1,'cv::FileStorage::operator<<(FileStorage &fs, const String &str)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a84431fd1b5075275f5c3407dc58b36ae',1,'cv::FileStorage::operator<<(FileStorage &fs, const _Tp &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#acdfed1145ad6cc92e20975596c7b8bed',1,'cv::FileStorage::operator<<(FileStorage &fs, const char *str)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae1a501b3d13d8fd3de1b7299926a02cd',1,'cv::FileStorage::operator<<(FileStorage &fs, char *value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a84431fd1b5075275f5c3407dc58b36ae',1,'cv::FileStorage::operator<<(FileStorage &fs, const _Tp &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#acdfed1145ad6cc92e20975596c7b8bed',1,'cv::FileStorage::operator<<(FileStorage &fs, const char *str)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae1a501b3d13d8fd3de1b7299926a02cd',1,'cv::FileStorage::operator<<(FileStorage &fs, char *value)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a674a3009537b05a655ad483acd8e09eb',1,'cv::VideoWriter::operator<<(const Mat &image)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#ad9a866bd422a46216993e8015f8f68cf',1,'cv::VideoWriter::operator<<(const UMat &image)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'basic_iostream< char >::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'basic_iostream< char >::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_iostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_iostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_iostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_iostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_iostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_iostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_iostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_iostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_iostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_iostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_iostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_iostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_iostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_iostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_iostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_iostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_iostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_iostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_iostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_iostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_iostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_iostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_iostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_iostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_iostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_iostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_iostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_iostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_iostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_iostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'basic_ostream< char >::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'basic_ostream< char >::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'basic_ostream< char, _Traits >::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'basic_ostream< char, _Traits >::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char, _Traits >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char, _Traits >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char, _Traits >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char, _Traits >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char, _Traits >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char, _Traits >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char, _Traits >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char, _Traits >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char, _Traits >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char, _Traits >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char, _Traits >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char, _Traits >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char, _Traits >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char, _Traits >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char, _Traits >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char, _Traits >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char, _Traits >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char, _Traits >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char, _Traits >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char, _Traits >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char, _Traits >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char, _Traits >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char, _Traits >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char, _Traits >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char, _Traits >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char, _Traits >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char, _Traits >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char, _Traits >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char, _Traits >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char, _Traits >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a706fe0713381598aee2cf988bc299e5e',1,'gamma_distribution< double >::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a706fe0713381598aee2cf988bc299e5e',1,'gamma_distribution< result_type >::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#acc44ab3c56e9048acd13c60ca1a877e0',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abdfecf8325ed9e856625871fee2c56a3',1,'normal_distribution< double >::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abdfecf8325ed9e856625871fee2c56a3',1,'normal_distribution< result_type >::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_fstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_fstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_fstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_fstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_fstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_fstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_fstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_fstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_fstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_fstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_fstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_fstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_fstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_fstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_fstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_fstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_fstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_fstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_fstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_fstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_fstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_fstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_fstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_fstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_fstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_fstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_fstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_fstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_fstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_fstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_fstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_fstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_iostream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_iostream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_iostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_iostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_iostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_iostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_iostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_iostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_iostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_iostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_iostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_iostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_iostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_iostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_iostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_iostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_iostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_iostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_iostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_iostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_iostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_iostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_iostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_iostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_iostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_iostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_iostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_iostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_iostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_iostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_iostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_iostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_ofstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_ofstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ofstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ofstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ofstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ofstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ofstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ofstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ofstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ofstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ofstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ofstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ofstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ofstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ofstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ofstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ofstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ofstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ofstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ofstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ofstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ofstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ofstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ofstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ofstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ofstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ofstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ofstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ofstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ofstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ofstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ofstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_ostream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_ostream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_ostringstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_ostringstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_stringstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_stringstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_stringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_stringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_stringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_stringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_stringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_stringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_stringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_stringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_stringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_stringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_stringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_stringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_stringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_stringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_stringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_stringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_stringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_stringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_stringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_stringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_stringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_stringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_stringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_stringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_stringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_stringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_stringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_stringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_stringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_stringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a414a99f11823d3fdfed86fc37f55690b',1,'std::binomial_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a725f2ea3af449e1e3286300e694d863d',1,'std::bitset::operator<<(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a725f2ea3af449e1e3286300e694d863d',1,'std::bitset::operator<<(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#aebe1b72f5b814d959f807aaaf5e6319e',1,'std::chi_squared_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#acefef9fae1a48c92ebc15b4c930dbf08',1,'std::discard_block_engine::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a0da5726a47d5a89fc4d67118558d5834',1,'std::discrete_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#ae32074f867a5686e7e7dab19d6f4cf2b',1,'std::fisher_f_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a706fe0713381598aee2cf988bc299e5e',1,'std::gamma_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#af5e6423d264a9888844b74c2f9944199',1,'std::linear_congruential_engine::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#aad98f5fc7ecc4ae82fe15f6a67e80d1f',1,'std::lognormal_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#acc44ab3c56e9048acd13c60ca1a877e0',1,'std::mersenne_twister_engine::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#a57bcf7aaeecf810d2c7c6c3f0c9f4fbe',1,'std::negative_binomial_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abdfecf8325ed9e856625871fee2c56a3',1,'std::normal_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a21261460e85c8e44b5e16af905d5340e',1,'std::piecewise_constant_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#aafa2a9199eaba83988659ff880994af5',1,'std::piecewise_linear_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a9264a0eb6efd5ac01a57ed452e6f6d9a',1,'std::poisson_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a3f5b86dc97ab5a895d0860b6414f9350',1,'std::shuffle_order_engine::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a933f8fad751874c75b687b3c6db144b4',1,'std::student_t_distribution::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a877333097a3e4f3b054c3c763654e965',1,'std::subtract_with_carry_engine::operator<<'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a436906ba9f65924c521aba3f4c981616',1,'std::tr2::dynamic_bitset::operator<<(size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a436906ba9f65924c521aba3f4c981616',1,'std::tr2::dynamic_bitset::operator<<(size_type __pos) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'Eigen::DenseBase::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'Eigen::DenseBase::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'Eigen::DenseBase::operator<<(std::ostream &s, const DenseBase< Derived > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator<<(std::ostream &s, const DenseBase< ArrayWrapper< ExpressionType > > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator<<(std::ostream &s, const DenseBase< Homogeneous< MatrixType, _Direction > > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'DenseBase< Solve< Decomposition, RhsType > >::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'DenseBase< Solve< Decomposition, RhsType > >::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'DenseBase< Solve< Decomposition, RhsType > >::operator<<(std::ostream &s, const DenseBase< Solve< Decomposition, RhsType > > &m)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5e34c5435e557d0bf666bd7311211405.html#a5e34c5435e557d0bf666bd7311211405',1,'nlohmann::basic_json::operator<<'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a60ca396028b8d9714c6e10efbf475af6.html#a60ca396028b8d9714c6e10efbf475af6',1,'nlohmann::basic_json::operator<<'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#abadf4e6fb19d70207d8e5600747b8c2c',1,'cv::operator<<(std::ostream &os, const GMetaArg &)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a83a3132a9b08145ceb61a56eb1abcd11',1,'cv::operator<<(std::ostream &os, const cv::GArrayDesc &desc)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a0c9fa53616ecd94efd7e9359dd439cb0',1,'cv::operator<<(std::ostream &os, const cv::GScalarDesc &desc)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#aa078055dbff233794a73da855cdd1288',1,'cv::operator<<(std::ostream &os, const cv::GMatDesc &desc)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5cdb7018d77509d22194d74f8e066f4c',1,'cv::operator<<(std::ostream &out, const TickMeter &tm)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacef821c50106276406bf4bc1cd7a059a',1,'cv::operator<<(const v_reg< _Tp, n > &a, int imm)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf47f069bbc73929ec5fd73ce9947339a',1,'cv::operator<<(String &out, Ptr< Formatted > fmtd)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3557054d1f0f079cf5e60a44851e4c70',1,'cv::operator<<(String &out, const Mat &mtx)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89d6a7eb3b4253c351bdd5c87bd6e15c',1,'cv::cudev::operator<<(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac309e654bf56a92bce54257f60224978',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37724ee1b2714aa21d8333bdd0b60332',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d89446b9cd1b84d4c54b3626ea797dd',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23de5acc1ec45d07a00fe8f37f7f2702',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2526c7f52b4492a5c8f41c30b2f21de',1,'cv::cudev::operator<<(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdab9d7d458a6819636e2031176dbf19',1,'cv::cudev::operator<<(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf98ccc0340ec81f52ec4c4079978a10a',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fbe62deadc03136397368ef9858f6f7',1,'cv::cudev::operator<<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf970863271a297e3197d7f9d1c6fba2c',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5141661e7abfe6f695104cd2f80199cc',1,'cv::cudev::operator<<(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa02b5451a03bbfe3fb34a0997e2c337f',1,'cv::cudev::operator<<(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca5eab3b992fbcf25f4089bd19ba2d80',1,'cv::cudev::operator<<(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e6980cc8c55e7d4d2a6b543d5ea145d',1,'cv::cudev::operator<<(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6a5b89d72294aa4f962767ee2fc0537',1,'cv::cudev::operator<<(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5184147f1ae14d34ebe791b02bb23617',1,'cv::cudev::operator<<(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac84a8246095fdb1ee004cff3802ab4e0',1,'cv::cudev::operator<<(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83575e7f013d7c113a991948c4b65314',1,'cv::cudev::operator<<(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga342190a6ce5ef956b5b54a8f9b2c7317',1,'cv::cudev::operator<<(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32b6410f888d77e0bd160d6fe83824',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e299bf0650ac5d0f894ac165109e219',1,'cv::cudev::operator<<(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b494e6b58845e60c37350325d48268',1,'cv::cudev::operator<<(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f12be0b00cb28aa3a721b8dc96c9bc',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga519fefe984648ac2ccb3778d3ed0b48b',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a848acecc1b2682cf97f8da363569e24f',1,'cv::dnn::operator<<()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a41e9a5ded43842da10ea7875e9d9a1aa',1,'cv::gapi::own::operator<<(std::ostream &o, const Rect &rect)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ad54ba083ef5d8b00875c97b457341dc9',1,'cv::gapi::own::operator<<(std::ostream &o, const Size &s)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf47f069bbc73929ec5fd73ce9947339a',1,'operator<<(String &out, Ptr< Formatted > fmtd)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3557054d1f0f079cf5e60a44851e4c70',1,'operator<<(String &out, const Mat &mtx)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5cdb7018d77509d22194d74f8e066f4c',1,'operator<<(std::ostream &out, const TickMeter &tm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacef821c50106276406bf4bc1cd7a059a',1,'operator<<(const v_reg< _Tp, n > &a, int imm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89d6a7eb3b4253c351bdd5c87bd6e15c',1,'operator<<(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac309e654bf56a92bce54257f60224978',1,'operator<<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37724ee1b2714aa21d8333bdd0b60332',1,'operator<<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d89446b9cd1b84d4c54b3626ea797dd',1,'operator<<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23de5acc1ec45d07a00fe8f37f7f2702',1,'operator<<(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2526c7f52b4492a5c8f41c30b2f21de',1,'operator<<(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdab9d7d458a6819636e2031176dbf19',1,'operator<<(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf98ccc0340ec81f52ec4c4079978a10a',1,'operator<<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fbe62deadc03136397368ef9858f6f7',1,'operator<<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf970863271a297e3197d7f9d1c6fba2c',1,'operator<<(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5141661e7abfe6f695104cd2f80199cc',1,'operator<<(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa02b5451a03bbfe3fb34a0997e2c337f',1,'operator<<(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca5eab3b992fbcf25f4089bd19ba2d80',1,'operator<<(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e6980cc8c55e7d4d2a6b543d5ea145d',1,'operator<<(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6a5b89d72294aa4f962767ee2fc0537',1,'operator<<(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5184147f1ae14d34ebe791b02bb23617',1,'operator<<(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac84a8246095fdb1ee004cff3802ab4e0',1,'operator<<(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83575e7f013d7c113a991948c4b65314',1,'operator<<(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga342190a6ce5ef956b5b54a8f9b2c7317',1,'operator<<(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32b6410f888d77e0bd160d6fe83824',1,'operator<<(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e299bf0650ac5d0f894ac165109e219',1,'operator<<(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b494e6b58845e60c37350325d48268',1,'operator<<(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f12be0b00cb28aa3a721b8dc96c9bc',1,'operator<<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga519fefe984648ac2ccb3778d3ed0b48b',1,'operator<<(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8f7159a55b4df5308fa03b531586fb2b',1,'std::operator<<(std::basic_ostream< _Ch, _Tr > &__os, const __shared_ptr< _Tp, _Lp > &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga2ba7b3cbabd5345e19d26796f766c6c0',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__os, const complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8d0f4660661dc80ee079bdfa88eebd2b',1,'std::operator<<(_Ostream &&__os, const _Tp &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga1e56f8bee410b0ebf924661d35faf834',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga3e80f96ee978fcba07dec04a3d9e1f3b',1,'std::operator<<(basic_ostream< _Ch_type, _Ch_traits > &__os, const sub_match< _Bi_iter > &__m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#ga268e36f52e1a1ba938eeaa95509796ca',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_int_distribution< _IntType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gad31a64335591da810bc4719b847783ec',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_real_distribution< _RealType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac4faea5494eaad9201d45d8687792782',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__os, const __gnu_cxx::__versa_string< _CharT, _Traits, _Alloc, _Base > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabc0fe37b26c3b5de242cd4261cde3aed',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::cauchy_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga17d284660a1656bc205dd834125e5543',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::bernoulli_distribution &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga50ccdd252598b9c017837d26588463d2',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::geometric_distribution< _IntType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga24847f7a1a655893e956f636db4e9f3a',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::exponential_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5d78bcb5583afa9e1871301f9d6d9c68',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::weibull_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga65897cd1a592c0a6c399072ec1ef7192',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::extreme_value_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7ce367a2dac030dcf212d89846f6c6ff',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__os, const basic_string< _CharT, _Traits, _Alloc > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a20aaa750b7ddf43635768c7b2d0385e6',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const bitset< _Nb > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4162d00742462ffb4e5b792edd81e594',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afe8641d2d416e2c56bae3ae4294de5f9',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abb2dcd26142d2d22961a30d8407161be',1,'std::operator<<(basic_ostream< char, _Traits > &__out, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a105a937bc8d1394e0bb683dea33b9f1b',1,'std::operator<<(basic_ostream< char, _Traits > &__out, signed char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4b69f99d144efda14d0e97f2eda925a7',1,'std::operator<<(basic_ostream< char, _Traits > &__out, unsigned char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6c05be9ccf056df69e524be5751af66b',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa6c746960bcd91f0e547628fb5f04cde',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6d6a581dcdff7c878cd963e5f14c0c56',1,'std::operator<<(basic_ostream< char, _Traits > &__out, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af3b2cf95d3db957b00a07c89c708fee2',1,'std::operator<<(basic_ostream< char, _Traits > &__out, const signed char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9d1f9961c2210c515937937c3a75b28e',1,'std::operator<<(basic_ostream< char, _Traits > &__out, const unsigned char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html#a75a3eb00bb313c120599e8341bf27d16',1,'std::__detail::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const _Quoted_string< _String, _CharT > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html#a5e78e46b4d59d40bf8839a5cb176fa6a',1,'std::__detail::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const _Quoted_string< const _CharT *, _CharT > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gaf5eb3c897d120abd3981d431b0c57b35',1,'std::tr2::operator<<()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga17d284660a1656bc205dd834125e5543',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::bernoulli_distribution &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga50ccdd252598b9c017837d26588463d2',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::geometric_distribution< _IntType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga2ba7b3cbabd5345e19d26796f766c6c0',1,'operator<<(basic_ostream< _CharT, _Traits > &__os, const complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gaf5eb3c897d120abd3981d431b0c57b35',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const dynamic_bitset< _WordT, _Alloc > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabc0fe37b26c3b5de242cd4261cde3aed',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::cauchy_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8f7159a55b4df5308fa03b531586fb2b',1,'operator<<(std::basic_ostream< _Ch, _Tr > &__os, const __shared_ptr< _Tp, _Lp > &__p)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga24847f7a1a655893e956f636db4e9f3a',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::exponential_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5d78bcb5583afa9e1871301f9d6d9c68',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::weibull_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga65897cd1a592c0a6c399072ec1ef7192',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::extreme_value_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga1e56f8bee410b0ebf924661d35faf834',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga3e80f96ee978fcba07dec04a3d9e1f3b',1,'operator<<(basic_ostream< _Ch_type, _Ch_traits > &__os, const sub_match< _Bi_iter > &__m)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#ga268e36f52e1a1ba938eeaa95509796ca',1,'operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_int_distribution< _IntType > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gad31a64335591da810bc4719b847783ec',1,'operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_real_distribution< _RealType > &)(Global Namespace)']]], + ['operator_3c_3c_3d_325',['operator<<=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac36920b534a80be4cc1e6e80c68d2be5',1,'std::bitset::operator<<=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac36920b534a80be4cc1e6e80c68d2be5',1,'std::bitset::operator<<=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga30a493dbd85a2271bcc09d9d24f387b2',1,'std::gslice_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga43fc95bcbd0f89c0468f249209eb587b',1,'std::indirect_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc9fb4be42ab111a8b17efc9480006c7',1,'std::mask_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15a72598162a7183c3be5cfdcb43a94b',1,'std::slice_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a0052dae6eec21a15abee0bb7f339611d',1,'std::tr2::dynamic_bitset::operator<<=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a0052dae6eec21a15abee0bb7f339611d',1,'std::tr2::dynamic_bitset::operator<<=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga435a2811affb685f15934a9204bed29e',1,'std::valarray::operator<<=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9635c78d05a1fcbc22885223c1432f25',1,'std::valarray::operator<<=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga435a2811affb685f15934a9204bed29e',1,'valarray< size_t >::operator<<=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9635c78d05a1fcbc22885223c1432f25',1,'valarray< size_t >::operator<<=(const valarray< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga30a493dbd85a2271bcc09d9d24f387b2',1,'operator<<=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga435a2811affb685f15934a9204bed29e',1,'operator<<=(const _Tp &)(Global Namespace)']]], + ['operator_3c_3d_326',['operator<=',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a630e58dd233abf6b6ff3393be67454c0',1,'cv::MatExpr::operator<=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abeea3d9de568017193b26eea645c98f3',1,'cv::MatExpr::operator<=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a21b436ed46cb4ec5a3628576a10190fe',1,'cv::MatExpr::operator<=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0a628b41fded09b2e899b46836590de3',1,'cv::MatExpr::operator<=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8a039003baebfa48ba24de81f7f4d931',1,'cv::MatExpr::operator<=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a630e58dd233abf6b6ff3393be67454c0',1,'cv::MatExpr::operator<=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abeea3d9de568017193b26eea645c98f3',1,'cv::MatExpr::operator<=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a21b436ed46cb4ec5a3628576a10190fe',1,'cv::MatExpr::operator<=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0a628b41fded09b2e899b46836590de3',1,'cv::MatExpr::operator<=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8a039003baebfa48ba24de81f7f4d931',1,'cv::MatExpr::operator<=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaa804bf096018d007e2a7894cdb98037a',1,'cv::softdouble::operator<=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6c17bb1577e0284585be0ba580811e8f',1,'cv::softfloat::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#a406eb3652a303e46bd225a4046401bf4',1,'__gnu_parallel::_GuardedIterator::operator<='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5c8bb5200f5eac10d31e26be46e5b1ac.html#a5c8bb5200f5eac10d31e26be46e5b1ac',1,'nlohmann::basic_json::operator<='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ae7bce6989e2bf72aa0784ca6755e22a9.html#ae7bce6989e2bf72aa0784ca6755e22a9',1,'nlohmann::basic_json::operator<='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4e96b98c1f8dfccaaa94aa0d5e77427c.html#a4e96b98c1f8dfccaaa94aa0d5e77427c',1,'nlohmann::basic_json::operator<='],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga02b1b9dcfcefdfb34dadf0cd35ba61a3',1,'cv::operator<=()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1ead1ff269aa97694b6497d29e1e29c',1,'cv::cudev::operator<=(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa62bc6367673e025ae709593a9b656e5',1,'cv::cudev::operator<=(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23f1ab559dd9692502ce026417f45408',1,'cv::cudev::operator<=(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78bf3eb6d82e42dc66cf49fb78f79231',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19f33206e415060c1a0ea1eb3000d96b',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffe8680754ff4aa69ba039a79faf6626',1,'cv::cudev::operator<=(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1da871666d7dd2e618b145e8864929e8',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga701bfc015fbda0963f2803b27aca4d33',1,'cv::cudev::operator<=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff9c454089fcf80143cd32fa50238fcd',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23bf29cabff89d8549d818ef43147c14',1,'cv::cudev::operator<=(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga296d4d026d70f8f76aab066328f3d3fa',1,'cv::cudev::operator<=(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45ca16669f94b285db4334a262f80063',1,'cv::cudev::operator<=(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22e88dd408d2e5cff64faeab249681ba',1,'cv::cudev::operator<=(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a750fb20efa2f5a06000ccf33cd759b',1,'cv::cudev::operator<=(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ce34596d222bf804c1e9bf7e3d1243',1,'cv::cudev::operator<=(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11bdd191156ebdab62005a519b325200',1,'cv::cudev::operator<=(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b2b32ec5290e7e12efc0856bd5f743',1,'cv::cudev::operator<=(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf04bc7968693077bc7d4f2823645b88e',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga008bc5070a5b0e4af5cf5191f5d6b9d6',1,'cv::cudev::operator<=(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a9a3aa7951e9c0e8d8adfbda9a72209',1,'cv::cudev::operator<=(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga818519c31a2652549a00cd4d7393d79e',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab796146ad2e11416ac65fba37c0b8625',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07ebffec69ff52e0b06760664c1f6734',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadb89b24d295438f54277d245ece9366',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fc00541a0243c34358a3bf00f4da05a',1,'cv::cudev::operator<=(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90197d0db673130bc8a100773411d4bd',1,'cv::cudev::operator<=(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7e43a07a9aa0a10c8d37116f06bd9a',1,'cv::cudev::operator<=(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc2939c217e196e51ecd1b2a3e06c153',1,'cv::cudev::operator<=(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fe4a35b631b3aaa2e0e857bcbbd6bad',1,'cv::cudev::operator<=(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae309099345eee12887e40f5b0b050f3e',1,'cv::cudev::operator<=(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad102af955636969a42dbffc6dbb01b46',1,'cv::cudev::operator<=(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc0e7fca81b7c89968d39d89dc649b7a',1,'cv::cudev::operator<=(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21fc2950b93de4f956fbaf0758feb6a1',1,'cv::cudev::operator<=(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d7b36c9336f6fc1a843e54c4df8f0e',1,'cv::cudev::operator<=(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41851377c29b820cf0506e6a0e709782',1,'cv::cudev::operator<=(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12057494f0e2df897df3fc9841779e4d',1,'cv::cudev::operator<=(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10792a96e7eb2e17bb8163ef90a323b4',1,'cv::cudev::operator<=(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7fbfe98286073cd2a5660902a39f04',1,'cv::cudev::operator<=(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a1bebcff32a1bf7d2575d05bfeb7890',1,'cv::cudev::operator<=(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff6fe97435e41e89de0bdef31594a96',1,'cv::cudev::operator<=(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa56d3d64ea9d3eb351f5df4712c7d56f',1,'cv::cudev::operator<=(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468b559ecf6624521e1c1dd45ef6d2e6',1,'cv::cudev::operator<=(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc5c1c549707034c570459ffee3e806',1,'cv::cudev::operator<=(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9643b2618b16b6ab86f270012d70212a',1,'cv::cudev::operator<=(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788e492c5f919e8367629179e2524611',1,'cv::cudev::operator<=(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb572141a492105ee211ba7c12d0777',1,'cv::cudev::operator<=(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5db9beb4e23e8a160a22aa678720a87',1,'cv::cudev::operator<=(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bed66c4065e1f21bc76995bfa99752b',1,'cv::cudev::operator<=(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e90fe2cf3b8c107bfe31aa0b2f94e3c',1,'cv::cudev::operator<=(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga576e04d2f78108d39b4461fcf6aded03',1,'cv::cudev::operator<=(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0c263dc40917991d1a7039432d3d4f9',1,'cv::cudev::operator<=(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5edc4d4087d24b678e8daf4926370ea',1,'cv::cudev::operator<=(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13f7090565e4f7e704870536ed987057',1,'cv::cudev::operator<=(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cd1eaa84e6d908ae0e907de12fdcde9',1,'cv::cudev::operator<=(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga375fc5f28c2b1e5962243287a28e5b58',1,'cv::cudev::operator<=(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab9131041d6fc4ae7360291aee9b26',1,'cv::cudev::operator<=(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f106914932b4cab06413eb2632ef2cd',1,'cv::cudev::operator<=(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04227753f6db79fdbfb9715240961a97',1,'cv::cudev::operator<=(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12191665fdc650dbf8500db71892fd0',1,'cv::cudev::operator<=(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1001c72e6391934b7daaf15c66ab0d7',1,'cv::cudev::operator<=(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75483e6deab8535ed86eb6dc65947e0f',1,'cv::cudev::operator<=(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72810c269851aae026716559fa2af537',1,'cv::cudev::operator<=(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14aafc9b0e4ab5e8090d0ac9a679583',1,'cv::cudev::operator<=(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23d29f809003619e6d82b5b7ea7de995',1,'cv::cudev::operator<=(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd09b7cc4b4786532fda053066dcbafd',1,'cv::cudev::operator<=(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31edb90c4322609ec771e66e4583739e',1,'cv::cudev::operator<=(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33819e2576485dff43ab99ca0e19560e',1,'cv::cudev::operator<=(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b66f84f7275665c91b9fed5aed59be5',1,'cv::cudev::operator<=(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35728a641902e5d67a7531342d2d43a1',1,'cv::cudev::operator<=(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e1e3238a8f002f82a398ca042d3db2',1,'cv::cudev::operator<=(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37b679d33d766b5ce00013e7c96fc4c',1,'cv::cudev::operator<=(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56fd29329dd70b608a25f8f8b462562f',1,'cv::cudev::operator<=(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92c40110cfc6a7a10651b46b15c7533e',1,'cv::cudev::operator<=(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b2a3a801109a2a06e5da8675728fe58',1,'cv::cudev::operator<=(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga250eb7cdcb64312f4e2641501dc9baee',1,'cv::cudev::operator<=(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f0089cb1db00710fd7233770bc30b60',1,'cv::cudev::operator<=(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef2bba33802f57daa91e22602079a3a7',1,'cv::cudev::operator<=(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c460da93b4a465dbb65ea6c98d08e0',1,'cv::cudev::operator<=(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247f899b55928b075fc919076f5e5949',1,'cv::cudev::operator<=(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga914be25957de16f44b85396ba88a7f5d',1,'cv::cudev::operator<=(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e5a6258674087258ec46bf94c668353',1,'cv::cudev::operator<=(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2dbc819cf82263e9ec490552404734',1,'cv::cudev::operator<=(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eff31462c5876d989bad00f346ab183',1,'cv::cudev::operator<=(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03fe55d350f74009fef23cbf85c265c4',1,'cv::cudev::operator<=(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad73033b2ed798b55ac0e978547e2dcdd',1,'cv::cudev::operator<=(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08dfbf27c72c08bc5b257948694cc3e1',1,'cv::cudev::operator<=(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7460f2ca99c07231e71c964b4b584ac',1,'cv::cudev::operator<=(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b414d7742537f5def6a1f1dbbcee688',1,'cv::cudev::operator<=(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a1f07e6149542f2488750c2af3c068',1,'cv::cudev::operator<=(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc181ce10142dbd76ee1376a3cd90fdd',1,'cv::cudev::operator<=(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40b2bb5b5a77fa89913fb57853cde453',1,'cv::cudev::operator<=(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac06f6f101ec8cfcaf490ec6f041a837f',1,'cv::cudev::operator<=(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8e0bfab992ab8a121c15af1e82829ac',1,'cv::cudev::operator<=(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e24ea99fa24b52f3669e40c16c2a0f7',1,'cv::cudev::operator<=(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1e079957fbf820718af8a90067d68a9',1,'cv::cudev::operator<=(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93b6391a06707b6be2ca59da57057086',1,'cv::cudev::operator<=(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61706e65d948e11d869534a6653c00bf',1,'cv::cudev::operator<=(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99abc45e21e9f42fd926a8e83cdab296',1,'cv::cudev::operator<=(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba541b96bbc1af333e8a13eb1dc169d',1,'cv::cudev::operator<=(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7a9638a0e70f17231a9e10fecedb0b2',1,'cv::cudev::operator<=(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga455fe5a0dbcd6e20648e5bc2dd13fd6c',1,'cv::cudev::operator<=(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2618b57557803d2ac6d3450904bf7e6',1,'cv::cudev::operator<=(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ad206b773be555181e771e60d3d80d',1,'cv::cudev::operator<=(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2589f700026397ad0058d21462da1714',1,'cv::cudev::operator<=(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac57dc63fcc9e6782a2af19c0a14bf769',1,'cv::cudev::operator<=(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5f991c778ac1f18cd26ec9a6ae5ff72',1,'cv::cudev::operator<=(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7a1cc2de07b5b85ef8a5b16d01e487b',1,'cv::cudev::operator<=(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa452eeb5d53100bd938b7e1bb338d995',1,'cv::cudev::operator<=(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987b56ea0c72d063c0556dd6cac14929',1,'cv::cudev::operator<=(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9292c118b4add3d2e427413547c585fb',1,'cv::cudev::operator<=(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546cd23c9536ca329dbc1c6cccb7497',1,'cv::cudev::operator<=(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ec0c62ac154d66d9623f15fdac7c91',1,'cv::cudev::operator<=(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f767e3bf13cbd06503128dae485024',1,'cv::cudev::operator<=(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e42dbf144296f0d9586569a04f490',1,'cv::cudev::operator<=(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga616315867d4da80fdfe8216599b6537e',1,'cv::cudev::operator<=(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92fbe24a4d7fc8e87ea5663cad49fcf1',1,'cv::cudev::operator<=(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73c4504f2ad38a1eb98bcf0da9989196',1,'cv::cudev::operator<=(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga525f070d7c6ab195d7c415794a412214',1,'cv::cudev::operator<=(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb29143e8afd81a0c0f520bb43c16b6',1,'cv::cudev::operator<=(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cb74c8f5ee39656481d92ba33911254',1,'cv::cudev::operator<=(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6c17bb1577e0284585be0ba580811e8f',1,'operator<=(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaa804bf096018d007e2a7894cdb98037a',1,'operator<=(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga02b1b9dcfcefdfb34dadf0cd35ba61a3',1,'operator<=(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1ead1ff269aa97694b6497d29e1e29c',1,'operator<=(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa62bc6367673e025ae709593a9b656e5',1,'operator<=(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23f1ab559dd9692502ce026417f45408',1,'operator<=(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78bf3eb6d82e42dc66cf49fb78f79231',1,'operator<=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19f33206e415060c1a0ea1eb3000d96b',1,'operator<=(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffe8680754ff4aa69ba039a79faf6626',1,'operator<=(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1da871666d7dd2e618b145e8864929e8',1,'operator<=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga701bfc015fbda0963f2803b27aca4d33',1,'operator<=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff9c454089fcf80143cd32fa50238fcd',1,'operator<=(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23bf29cabff89d8549d818ef43147c14',1,'operator<=(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga296d4d026d70f8f76aab066328f3d3fa',1,'operator<=(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45ca16669f94b285db4334a262f80063',1,'operator<=(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22e88dd408d2e5cff64faeab249681ba',1,'operator<=(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a750fb20efa2f5a06000ccf33cd759b',1,'operator<=(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ce34596d222bf804c1e9bf7e3d1243',1,'operator<=(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11bdd191156ebdab62005a519b325200',1,'operator<=(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b2b32ec5290e7e12efc0856bd5f743',1,'operator<=(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf04bc7968693077bc7d4f2823645b88e',1,'operator<=(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga008bc5070a5b0e4af5cf5191f5d6b9d6',1,'operator<=(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a9a3aa7951e9c0e8d8adfbda9a72209',1,'operator<=(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga818519c31a2652549a00cd4d7393d79e',1,'operator<=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab796146ad2e11416ac65fba37c0b8625',1,'operator<=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07ebffec69ff52e0b06760664c1f6734',1,'operator<=(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadb89b24d295438f54277d245ece9366',1,'operator<=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fc00541a0243c34358a3bf00f4da05a',1,'operator<=(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90197d0db673130bc8a100773411d4bd',1,'operator<=(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7e43a07a9aa0a10c8d37116f06bd9a',1,'operator<=(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc2939c217e196e51ecd1b2a3e06c153',1,'operator<=(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fe4a35b631b3aaa2e0e857bcbbd6bad',1,'operator<=(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae309099345eee12887e40f5b0b050f3e',1,'operator<=(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad102af955636969a42dbffc6dbb01b46',1,'operator<=(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc0e7fca81b7c89968d39d89dc649b7a',1,'operator<=(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21fc2950b93de4f956fbaf0758feb6a1',1,'operator<=(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d7b36c9336f6fc1a843e54c4df8f0e',1,'operator<=(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41851377c29b820cf0506e6a0e709782',1,'operator<=(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12057494f0e2df897df3fc9841779e4d',1,'operator<=(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10792a96e7eb2e17bb8163ef90a323b4',1,'operator<=(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7fbfe98286073cd2a5660902a39f04',1,'operator<=(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a1bebcff32a1bf7d2575d05bfeb7890',1,'operator<=(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff6fe97435e41e89de0bdef31594a96',1,'operator<=(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa56d3d64ea9d3eb351f5df4712c7d56f',1,'operator<=(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468b559ecf6624521e1c1dd45ef6d2e6',1,'operator<=(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc5c1c549707034c570459ffee3e806',1,'operator<=(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9643b2618b16b6ab86f270012d70212a',1,'operator<=(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788e492c5f919e8367629179e2524611',1,'operator<=(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb572141a492105ee211ba7c12d0777',1,'operator<=(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5db9beb4e23e8a160a22aa678720a87',1,'operator<=(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bed66c4065e1f21bc76995bfa99752b',1,'operator<=(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e90fe2cf3b8c107bfe31aa0b2f94e3c',1,'operator<=(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga576e04d2f78108d39b4461fcf6aded03',1,'operator<=(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0c263dc40917991d1a7039432d3d4f9',1,'operator<=(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5edc4d4087d24b678e8daf4926370ea',1,'operator<=(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13f7090565e4f7e704870536ed987057',1,'operator<=(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cd1eaa84e6d908ae0e907de12fdcde9',1,'operator<=(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga375fc5f28c2b1e5962243287a28e5b58',1,'operator<=(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab9131041d6fc4ae7360291aee9b26',1,'operator<=(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f106914932b4cab06413eb2632ef2cd',1,'operator<=(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04227753f6db79fdbfb9715240961a97',1,'operator<=(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12191665fdc650dbf8500db71892fd0',1,'operator<=(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1001c72e6391934b7daaf15c66ab0d7',1,'operator<=(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75483e6deab8535ed86eb6dc65947e0f',1,'operator<=(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72810c269851aae026716559fa2af537',1,'operator<=(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14aafc9b0e4ab5e8090d0ac9a679583',1,'operator<=(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23d29f809003619e6d82b5b7ea7de995',1,'operator<=(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd09b7cc4b4786532fda053066dcbafd',1,'operator<=(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31edb90c4322609ec771e66e4583739e',1,'operator<=(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33819e2576485dff43ab99ca0e19560e',1,'operator<=(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b66f84f7275665c91b9fed5aed59be5',1,'operator<=(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35728a641902e5d67a7531342d2d43a1',1,'operator<=(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e1e3238a8f002f82a398ca042d3db2',1,'operator<=(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37b679d33d766b5ce00013e7c96fc4c',1,'operator<=(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56fd29329dd70b608a25f8f8b462562f',1,'operator<=(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92c40110cfc6a7a10651b46b15c7533e',1,'operator<=(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b2a3a801109a2a06e5da8675728fe58',1,'operator<=(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga250eb7cdcb64312f4e2641501dc9baee',1,'operator<=(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f0089cb1db00710fd7233770bc30b60',1,'operator<=(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef2bba33802f57daa91e22602079a3a7',1,'operator<=(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c460da93b4a465dbb65ea6c98d08e0',1,'operator<=(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247f899b55928b075fc919076f5e5949',1,'operator<=(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga914be25957de16f44b85396ba88a7f5d',1,'operator<=(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e5a6258674087258ec46bf94c668353',1,'operator<=(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2dbc819cf82263e9ec490552404734',1,'operator<=(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eff31462c5876d989bad00f346ab183',1,'operator<=(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03fe55d350f74009fef23cbf85c265c4',1,'operator<=(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad73033b2ed798b55ac0e978547e2dcdd',1,'operator<=(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08dfbf27c72c08bc5b257948694cc3e1',1,'operator<=(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7460f2ca99c07231e71c964b4b584ac',1,'operator<=(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b414d7742537f5def6a1f1dbbcee688',1,'operator<=(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a1f07e6149542f2488750c2af3c068',1,'operator<=(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc181ce10142dbd76ee1376a3cd90fdd',1,'operator<=(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40b2bb5b5a77fa89913fb57853cde453',1,'operator<=(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac06f6f101ec8cfcaf490ec6f041a837f',1,'operator<=(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8e0bfab992ab8a121c15af1e82829ac',1,'operator<=(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e24ea99fa24b52f3669e40c16c2a0f7',1,'operator<=(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1e079957fbf820718af8a90067d68a9',1,'operator<=(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93b6391a06707b6be2ca59da57057086',1,'operator<=(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61706e65d948e11d869534a6653c00bf',1,'operator<=(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99abc45e21e9f42fd926a8e83cdab296',1,'operator<=(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba541b96bbc1af333e8a13eb1dc169d',1,'operator<=(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7a9638a0e70f17231a9e10fecedb0b2',1,'operator<=(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga455fe5a0dbcd6e20648e5bc2dd13fd6c',1,'operator<=(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2618b57557803d2ac6d3450904bf7e6',1,'operator<=(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ad206b773be555181e771e60d3d80d',1,'operator<=(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2589f700026397ad0058d21462da1714',1,'operator<=(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac57dc63fcc9e6782a2af19c0a14bf769',1,'operator<=(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5f991c778ac1f18cd26ec9a6ae5ff72',1,'operator<=(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7a1cc2de07b5b85ef8a5b16d01e487b',1,'operator<=(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa452eeb5d53100bd938b7e1bb338d995',1,'operator<=(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987b56ea0c72d063c0556dd6cac14929',1,'operator<=(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9292c118b4add3d2e427413547c585fb',1,'operator<=(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546cd23c9536ca329dbc1c6cccb7497',1,'operator<=(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ec0c62ac154d66d9623f15fdac7c91',1,'operator<=(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f767e3bf13cbd06503128dae485024',1,'operator<=(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e42dbf144296f0d9586569a04f490',1,'operator<=(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga616315867d4da80fdfe8216599b6537e',1,'operator<=(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92fbe24a4d7fc8e87ea5663cad49fcf1',1,'operator<=(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73c4504f2ad38a1eb98bcf0da9989196',1,'operator<=(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga525f070d7c6ab195d7c415794a412214',1,'operator<=(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb29143e8afd81a0c0f520bb43c16b6',1,'operator<=(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cb74c8f5ee39656481d92ba33911254',1,'operator<=(double s, const double4 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a8002d09a2b548cf3abc2bd4aeafbce78',1,'__gnu_cxx::operator<=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a08ad6f0a285af9120e6d882594281672',1,'__gnu_cxx::operator<=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a3672b11b2bb1fc3a4b22f6d29473af87',1,'__gnu_cxx::operator<=(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a930dd0467ade4b159f585b09a918c395',1,'std::operator<=(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8d12abc1fb7e7cd1c53769a0fc5ff75f',1,'std::operator<=(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9e2bd7d69af9d03b7df4858595a3202e',1,'std::operator<=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#adb3e9ff06db8a5cc1105aaea9e01abd2',1,'std::operator<=(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5b152596ab130d1c97908b694e5fd761',1,'std::operator<=(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga6d0ebab63e2fcfb19ad69237091d4d7f',1,'std::operator<=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a54c920ed5017335b380d77d540169c76',1,'std::operator<=(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fd4bec06d2b472f7002ee98aea643af',1,'std::operator<=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gac012e10e6bb4ba58875ad515b9b9f05d',1,'std::operator<=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga490e9054301cbb70120a6b0202cee45d',1,'std::operator<=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5620ce8b20ede9f7494a66af23212304',1,'std::operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga84b53be86a6dfea454c23d5207d0864d',1,'std::operator<=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af19b07884ac9b3b0986b70d79bdc7ec1',1,'std::operator<=(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a407132a3a46dfa53d8f1e7810ee5b54d',1,'std::operator<=(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeb2fd054122ecce964976201c05a73cc',1,'std::operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acc2c10d2a7234cc66fd327a6f65954f7',1,'std::operator<=(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab0de944941fcbe6618dba4837b31deaa',1,'std::operator<=(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8921c2d57c14b7e9702a9500bde8aba9',1,'std::operator<=(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a25c829a4d9c4e577f0b11223bd00aced',1,'std::operator<=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac39a97945b49c71df0816226ff72807f',1,'std::operator<=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a72de11bf9e31d206cda3e333812a3f5a',1,'std::operator<=(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a00e5655f35d242d0995153643aea2ebc',1,'std::__debug::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a513766abdb4ed2ba58d8792147ebf811',1,'std::__profile::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#aaf5340c412fb69ca76ea39d768f04ce4',1,'std::rel_ops::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gae39d9fee6e2bb1642be73a0474be71b3',1,'std::tr2::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gae39d9fee6e2bb1642be73a0474be71b3',1,'operator<=(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga6d0ebab63e2fcfb19ad69237091d4d7f',1,'operator<=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fd4bec06d2b472f7002ee98aea643af',1,'operator<=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gac012e10e6bb4ba58875ad515b9b9f05d',1,'operator<=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga490e9054301cbb70120a6b0202cee45d',1,'operator<=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5620ce8b20ede9f7494a66af23212304',1,'operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga84b53be86a6dfea454c23d5207d0864d',1,'operator<=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeb2fd054122ecce964976201c05a73cc',1,'operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9e2bd7d69af9d03b7df4858595a3202e',1,'operator<=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], + ['operator_3d_327',['operator=',['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a76321e46a6c9fd0cb68c1ecc862cb515',1,'cv::util::any::operator=(any &&)=default'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a825b496ef0087775e11beb91d157d0c8',1,'cv::util::any::operator=(any const &src)'],['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a13709e8c99dac446a1c1ed71798eee72',1,'cv::AsyncArray::operator=()'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#aa39cabdf05e3b14aadee5dec3e7baa0e',1,'cv::AsyncPromise::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'cv::AutoBuffer::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'AutoBuffer< double, 1 >::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'AutoBuffer< int64, 1 >::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'AutoBuffer< String, 1 >::operator=()'],['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#a52a7237f767b8d0269724c481329b6d5',1,'cv::detail::CameraParams::operator=()'],['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#a1b7982e6ea32e8653ae0543ff0a81354',1,'cv::CommandLineParser::operator=()'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a43a8ac6dd8cb0d342d39a65acf402217',1,'cv::ocl::Context::operator=()'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1gapi_1_1wip_1_1Data.html#a3ae38e8c51ce271fab188d7da2272fed',1,'cv::gapi::wip::Data::operator=(const T &t)'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1gapi_1_1wip_1_1Data.html#a5e490199d72c9f1c81663c3225c893d2',1,'cv::gapi::wip::Data::operator=(T &&t)'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a1b0465bff476900efb5ca2f238563997',1,'cv::ocl::Device::operator=()'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#acc5ccf38e7abf268d032074cff8d5cc2',1,'cv::dnn::DictValue::operator=()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7b1a3493d50b1d4fb636aa1550cdce34',1,'cv::FileNode::operator=()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#aeffb68f308d077062d0ced1a57ebd489',1,'cv::FileNodeIterator::operator=()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ad1432eed28a34f995a641a296281e01c',1,'cv::cuda::GpuMat::operator=()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a3e2a15bc4185f48943ed354e1b927ad6',1,'cv::cudev::GpuMat_::operator=(const GpuMat_ &m)'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a6075adc7a8150ea7069235c7793b7c69',1,'cv::cudev::GpuMat_::operator=(const Expr< Body > &expr)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a086c7947f5c106c9b238ba9dcbcb2f1c',1,'cv::cuda::HostMem::operator=()'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#a1034c0afe903b367b0f47c1916d9616f',1,'cv::ocl::Image2D::operator=()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#aa2694f462b29140fd21bc0e6f5380f0b',1,'cv::ocl::Kernel::operator=()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aed1f81fe7efaacc2bd95149cdfa34302',1,'cv::Mat::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a2a0798475170fb3a23b5bc63686de334',1,'cv::Mat::operator=(const MatExpr &expr)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa5c947f7e449a4d856a4f3a87fcebd50',1,'cv::Mat::operator=(const Scalar &s)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a86d190d68dbd801a2bd555d0905979fd',1,'cv::Mat::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a125f510bec573808666906a95ea09cb4',1,'cv::gapi::own::Mat::operator=(Mat const &src)=default'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#aa9caec4b6b0cf0f7ae8bb7808154d594',1,'cv::gapi::own::Mat::operator=(Mat &&src)=default'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a3709c060fa62e45132ab1932a73803c8',1,'cv::gapi::own::Mat::operator=(const Scalar &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'cv::Mat_::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'cv::Mat_::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'cv::Mat_::operator=(const _Tp &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'cv::Mat_::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'cv::Mat_::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'cv::Mat_::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< double >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< double >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< double >::operator=(const double &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< double >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< double >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< double >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< float >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< float >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< float >::operator=(const float &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< float >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< float >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< float >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< uchar >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< uchar >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< uchar >::operator=(const uchar &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< uchar >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< uchar >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< uchar >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< unsigned char >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< unsigned char >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< unsigned char >::operator=(const unsigned char &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< unsigned char >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< unsigned char >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< unsigned char >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#ae5b2d39c2deb60c6db6202034e28182d',1,'cv::detail::MatchesInfo::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#af1c80909af2a28c1b98c6bf1f53984d7',1,'cv::MatConstIterator::operator=()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#af7430e2fa55817bdd66753a5af7f3242',1,'cv::MatConstIterator_::operator=()'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#af31e606676d1cd6bdeedcbdd1ea4fb41',1,'cv::gapi::own::detail::MatHeader::operator=(const MatHeader &)=default'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#ac6efb1a462a75da9fad1c38cbbc99bac',1,'cv::gapi::own::detail::MatHeader::operator=(MatHeader &&src)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a531046b556e382f91c55e3076083f051',1,'cv::MatIterator_::operator=()'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a325af086a8a2a9be290ca92d3b4946c5',1,'cv::MatStep::operator=(size_t s)'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a9927dacc19715875bf7518207445e0ad',1,'cv::MatStep::operator=(const MatStep &)'],['https://docs.opencv.org/4.2.0/d7/dc2/classcv_1_1instr_1_1NodeData.html#af66d2f09b331f5de963a2cfa0d7ba21e',1,'cv::instr::NodeData::operator=()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a2e6daae54312f1bbe7a832e8083a7af9',1,'cv::util::optional::operator=(const optional &rhs)=default'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a11564f1271c6c1aa95c98ba7385c6779',1,'cv::util::optional::operator=(optional &&rhs)'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#ad7a69d27e55090b7019236b251d57a81',1,'cv::ocl::Platform::operator=()'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#ad25bce73d8db1173fd08fe631e2a2389',1,'cv::ocl::PlatformInfo::operator=()'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a892446cde2db30f149f572b92619dc9f',1,'cv::Point3_::operator=(const Point3_ &pt)'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a272296b0541449dbe926deb557f18fa7',1,'cv::Point3_::operator=(Point3_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'cv::Point_::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'cv::Point_::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'Point_< double >::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'Point_< double >::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'Point_< float >::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'Point_< float >::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'Point_< int >::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'Point_< int >::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a9d76780ecc8d97fe76ef926123c507c0',1,'cv::ocl::Program::operator=()'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#ac472f17bd1ee3bab677b38e773d82638',1,'cv::ocl::ProgramSource::operator=()'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#acaf2d9afbd65c6ade583f73a2c5023e5',1,'cv::ocl::Queue::operator=()'],['https://docs.opencv.org/4.2.0/d3/d22/classcv_1_1gapi_1_1own_1_1Rect.html#aca0529ecae368b5027176331f4257bd4',1,'cv::gapi::own::Rect::operator=()'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#ab9b239b3562b94f07e46551d05af97c6',1,'cv::Rect_::operator=(const Rect_ &r)'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a8228f59c183fca9695ae329dc773a3e1',1,'cv::Rect_::operator=(Rect_ &&r) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ad95d917b9fb9a0053929b2b5c84bb5b2',1,'cv::Scalar_::operator=(const Scalar_ &s)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a8ea9d461de3c6e04f64c2f2ee1751cd2',1,'cv::Scalar_::operator=(Scalar_ &&s) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ad95d917b9fb9a0053929b2b5c84bb5b2',1,'Scalar_< double >::operator=(const Scalar_ &s)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a8ea9d461de3c6e04f64c2f2ee1751cd2',1,'Scalar_< double >::operator=(Scalar_ &&s) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#aa126ea44724ae43d1fc1597397d9b3f5',1,'cv::gapi::own::Size::operator=()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a7a115285576d3211b24bda4628ee7f4d',1,'cv::Size_::operator=(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#aa7a87199e67360f44636ec30b1183fcd',1,'cv::Size_::operator=(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a7a115285576d3211b24bda4628ee7f4d',1,'Size_< float >::operator=(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#aa7a87199e67360f44636ec30b1183fcd',1,'Size_< float >::operator=(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf80704eb7bfc3257da30ad5a82fb9de',1,'cv::softdouble::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9451cdb3a66bebcc1f5e8b409f780b7f',1,'cv::softfloat::operator=()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a144c0f1ec1d3ffc20305bc4d1747b741',1,'cv::SparseMat::operator=(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a9e634f2d73a077444df4395e50821129',1,'cv::SparseMat::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#aa9ea60ee22d3ba75ccb16365eda3f096',1,'cv::SparseMat_::operator=(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a3a90de6441880eae3ba875a0fed2700e',1,'cv::SparseMat_::operator=(const SparseMat_ &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#aebaca1182543e7e71ee5c4f73a088c90',1,'cv::SparseMat_::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a9ad2aca73fd447e5642b1c21bd978cd3',1,'cv::SparseMatConstIterator::operator=()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#afe543867ec13099311670ad837eab611',1,'cv::SparseMatConstIterator_::operator=()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a69fe44b15c6618424367d24b8b99b9e4',1,'cv::SparseMatIterator::operator=()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#ad1d385d5c83a9c1104e9a197e331881c',1,'cv::SparseMatIterator_::operator=()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aac5e0ed13076c2371fa41d215a49b17f',1,'cv::UMat::operator=(const UMat &m)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a245c83dba9f05fc44d44d557f86101f1',1,'cv::UMat::operator=(const Scalar &s)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a561c1a335882bfe799e4235ee8fb67a6',1,'cv::UMat::operator=(UMat &&m)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a06701f71c52af321d833f6f3fdcfb89f',1,'cv::util::variant::operator=(const variant &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#abcd060a1b68f44893b2f15547f46b1d1',1,'cv::util::variant::operator=(variant &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a5d690841b784f348c9db1e741de8be0e',1,'cv::util::variant::operator=(T &&t) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a37e79528fb523179954532c12afb3e5b',1,'cv::util::variant::operator=(const variant< Ts... > &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a0f2388dd0dd28e24b5842cd1b432008c',1,'cv::util::variant::operator=(variant< Ts... > &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a06701f71c52af321d833f6f3fdcfb89f',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(const variant &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#abcd060a1b68f44893b2f15547f46b1d1',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(variant &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a5d690841b784f348c9db1e741de8be0e',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(T &&t) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a37e79528fb523179954532c12afb3e5b',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(const variant< Ts... > &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a0f2388dd0dd28e24b5842cd1b432008c',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(variant< Ts... > &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#afced2add96752159cd3a20f7592a528f',1,'cv::viz::Viz3d::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#a32e9fb3b4821e9aa0163c54fdcb8ce3c',1,'cv::viz::Widget::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a7bee901f7465419633250caa04983ef6',1,'__gnu_cxx::__versa_string::operator=(const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a46713802e19d9139db7468030060ebaf',1,'__gnu_cxx::__versa_string::operator=(__versa_string &&__str) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aa833376e55c1b6c75179e976043e6dd6',1,'__gnu_cxx::__versa_string::operator=(std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a01f0f4f2476992da89a882cb4f35c52e',1,'__gnu_cxx::__versa_string::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aa1d106b3b5ff8313d6d646f9aec5adc6',1,'__gnu_cxx::__versa_string::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#ae0afa6ce3f2e1d626b46ad157edb0a39',1,'__gnu_debug::_Safe_iterator::operator=(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a8289e4e52eca797212f8ed2f7ac06484',1,'__gnu_debug::_Safe_iterator::operator=(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#aa7d1bbc86a00f5af9a96cc55c7914cce',1,'__gnu_debug::_Safe_local_iterator::operator=(const _Safe_local_iterator &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a63641a3d3e09e8c2ef28e47d9f4b6057',1,'__gnu_debug::_Safe_local_iterator::operator=(_Safe_local_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#ae0afa6ce3f2e1d626b46ad157edb0a39',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator=(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a8289e4e52eca797212f8ed2f7ac06484',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator=(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#ae0afa6ce3f2e1d626b46ad157edb0a39',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator=(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a8289e4e52eca797212f8ed2f7ac06484',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator=(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< _CharT >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< _CharT >::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< _CharT >::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< _CharT >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< _CharT >::operator=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(_Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< char >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< char >::operator=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< char >::operator=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< char >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< char >::operator=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< char_type, _Traits, _Alloc >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< char_type, _Traits, _Alloc >::operator=(const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< char_type, _Traits, _Alloc >::operator=(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< char_type, _Traits, _Alloc >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< char_type, _Traits, _Alloc >::operator=(initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< value_type >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< value_type >::operator=(const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< value_type >::operator=(value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< value_type >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< value_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#acbbd2ced11be9e416c030bf3dcaeacad',1,'deque< _StateSeqT >::operator=(const deque &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a77734a257fa1c71752517d0ae6ae707d',1,'deque< _StateSeqT >::operator=(deque &&__x) noexcept(_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a74898d8b495f47ced979e6ba66c4eef1',1,'deque< _StateSeqT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a35a994d029c0e0cf92abf1f468cfa140',1,'list< __inp, __rebind_inp >::operator=(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8f9b65b72c23e8c124c5f4a6e11013e0',1,'list< __inp, __rebind_inp >::operator=(list &&__x) noexcept(_Node_alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b554a6eab6e57e565eedb7da72a83c5',1,'list< __inp, __rebind_inp >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aaa530908380c41e867d3d3d8d6dcf017',1,'match_results< _Bi_iter >::operator=(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a9066bb40864217bcf43710d9ea95bd86',1,'match_results< _Bi_iter >::operator=(match_results &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04755.html#af6ed2d0a405aee06f81dda8452a6e2ce',1,'std::__allocated_ptr::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#af798a3136d8030f2158837fde7373f5b',1,'std::auto_ptr::operator=(auto_ptr &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#adf78f102f371538dbe78a57976053736',1,'std::auto_ptr::operator=(auto_ptr< _Tp1 > &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#aa94f823e79ee65ed66fe128448d434ef',1,'std::back_insert_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a232af3b8f7c72e6c67ba9f3b6d1b256d',1,'std::basic_regex::operator=(const basic_regex &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a8d6c69a28d8c523cae6f7322095490d5',1,'std::basic_regex::operator=(basic_regex &&__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#aaf3c150b855c8dddc84f7a33519dba7f',1,'std::basic_regex::operator=(const _Ch_type *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#ae9f733548bcdaf906573129bed9c10fa',1,'std::basic_regex::operator=(initializer_list< _Ch_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a85898504e41caa15dfed44321f36c4c9',1,'std::basic_regex::operator=(const basic_string< _Ch_type, _Ch_traits, _Alloc > &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'std::basic_string::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'std::basic_string::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'std::basic_string::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'std::basic_string::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'std::basic_string::operator=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga92ff752125c60794c33d55db59b48105',1,'std::complex::operator=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaebc147a1a3a6e326215cd323aafa6bc6',1,'std::complex::operator=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#acbbd2ced11be9e416c030bf3dcaeacad',1,'std::deque::operator=(const deque &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a77734a257fa1c71752517d0ae6ae707d',1,'std::deque::operator=(deque &&__x) noexcept(_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a74898d8b495f47ced979e6ba66c4eef1',1,'std::deque::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a146ce22d8e7f66b46766d6de66fb6584',1,'std::experimental::fundamentals_v1::any::operator=(const any &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a0453d90a8d4fb2325712c4e5f3b909a7',1,'std::experimental::fundamentals_v1::any::operator=(any &&__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#af377e421f8e38d5873afb4d84aab606b',1,'std::experimental::fundamentals_v1::any::operator=(_ValueType &&__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a78c1273fb53228cab655addd77f9cd25',1,'std::forward_list::operator=(const forward_list &__list)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aaedecd0634ab8c057cca203778ea6cfa',1,'std::forward_list::operator=(forward_list &&__list) noexcept(_Node_alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a6b8dfcf0c3aad308699e909186c39f2b',1,'std::forward_list::operator=(std::initializer_list< _Tp > __il)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#ad88a7eabbaf51cfa7c8152e1c27d226f',1,'std::front_insert_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a698ecd83665a25c0c1f9cbe2ea85c2a0',1,'std::function< _Res(_ArgTypes...)>::operator=(const function &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a00bb39127d1936767cbfd81c4bb02354',1,'std::function< _Res(_ArgTypes...)>::operator=(function &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a05ea81faa27f6b5511b699634b83c4a8',1,'std::function< _Res(_ArgTypes...)>::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#afbb6bdd269617d2793d4dbbb078f6707',1,'std::function< _Res(_ArgTypes...)>::operator=(_Functor &&__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#afc4ca535d5508c13e9112b39c8c064d4',1,'std::function< _Res(_ArgTypes...)>::operator=(reference_wrapper< _Functor > __f) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga59fd646ebf243e99b2063baf37ba91d0',1,'std::gslice::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf25507c9a66f729500964d397b7cb9fb',1,'std::gslice_array::operator=(const gslice_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf2a0c3883cfb758e05e3d62ec7e0a07f',1,'std::gslice_array::operator=(const valarray< _Tp > &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8dfed8c043d7a82e4b71cf65c64ec844',1,'std::gslice_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga73cce032d98e922eeafb676920174f52',1,'std::indirect_array::operator=(const indirect_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6072ae14d756314665aef25c55cc4d33',1,'std::indirect_array::operator=(const valarray< _Tp > &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac17dafc8657c7fd6eab36a46260ff97f',1,'std::indirect_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a97b27e02a31008441dd0374c6a1021e4',1,'std::insert_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a35a994d029c0e0cf92abf1f468cfa140',1,'std::list::operator=(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8f9b65b72c23e8c124c5f4a6e11013e0',1,'std::list::operator=(list &&__x) noexcept(_Node_alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b554a6eab6e57e565eedb7da72a83c5',1,'std::list::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a21b4d6ac8a3c4614656b67eec61b5f9d',1,'std::locale::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a0ffbbf85c084d61ab49c7fec028bafba',1,'std::map::operator=(const map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a28b4c4feee2bbdf398540f4097d4bb91',1,'std::map::operator=(map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ac01f44f3ed4b9dbebcb046b4103f920c',1,'std::map::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac8928f66422bd3601fcf43b79761abd5',1,'std::mask_array::operator=(const mask_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2af95af73e734b394322ec304e1b73f2',1,'std::mask_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aaa530908380c41e867d3d3d8d6dcf017',1,'std::match_results::operator=(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a9066bb40864217bcf43710d9ea95bd86',1,'std::match_results::operator=(match_results &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#acd76a5f8a95e15654c8e61c55f1fdc61',1,'std::multimap::operator=(const multimap &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#aebc9eaf75029cfb33e4121a75a875713',1,'std::multimap::operator=(multimap &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a069fcb3baa5b568196b04950e380b865',1,'std::multimap::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a20d46cd310dd519085bca08a77ca0116',1,'std::multiset::operator=(const multiset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a572d0693c78910dc45ba3a5374066f7d',1,'std::multiset::operator=(multiset &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a92ec8ff818ef21f8d170842d4732299c',1,'std::multiset::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02635.html#adbefc6681906783e9e20249895a98082',1,'std::once_flag::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a3c5547f8d577192a0c4672ef08a1b166',1,'std::ostream_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#abcdedbb3c0f65a77d78cd15466ec7c73',1,'std::ostreambuf_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a86764099987b135d0966eda405b99de8',1,'std::regex_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a7701c80539dd9bb567d519151fe0484f',1,'std::regex_token_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a8ffd6bc39d7e301ec0f77568e4c531c2',1,'std::set::operator=(const set &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#afc8c71ffd02970fa13cd6f6fbd40682b',1,'std::set::operator=(set &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a8e269a4d9e589df1ef1bc6df659e7a96',1,'std::set::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga638dcc09b7202f5e671c6637bf01db31',1,'std::slice_array::operator=(const slice_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab5edb43da924e3c138ba22d29dc4c050',1,'std::slice_array::operator=(const valarray< _Tp > &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga3ddb6f583d7c7ef17b471662a4a7a7ac',1,'std::slice_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a0aa055c3e0b3e447ea378c5982952d20',1,'std::tr2::dynamic_bitset::operator=(const dynamic_bitset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a617447d4740d9204992d8119a838aff7',1,'std::tr2::dynamic_bitset::operator=(dynamic_bitset &&__b) noexcept(std::is_nothrow_move_assignable< _Base >::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'std::unique_ptr::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'std::unique_ptr::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'std::unique_ptr::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a6591772e73b9c09f47f348484995e811',1,'std::unique_ptr< _Tp[], _Dp >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#ac4e60274f821a367b846aaf799897792',1,'std::unique_ptr< _Tp[], _Dp >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#ac873de4914a9d9182497101f8c66ac10',1,'std::unique_ptr< _Tp[], _Dp >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aca0525353d274a1abca19e123ca58702',1,'std::unordered_map::operator=(const unordered_map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d63494d15ed6c47df072d06d9608ca0',1,'std::unordered_map::operator=(unordered_map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a46087d4d85698c13e7fe5e10f13821d1',1,'std::unordered_map::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a04b3ff006b08f143403c12e743ced9b6',1,'std::unordered_multimap::operator=(const unordered_multimap &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac9f4a7b990b045b2709562eb6b7f9328',1,'std::unordered_multimap::operator=(unordered_multimap &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a1dd84e27aa97a782f79e757eadcd5461',1,'std::unordered_multimap::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a9e17536caf4f009c1a337cbdc65b10e4',1,'std::unordered_multiset::operator=(const unordered_multiset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#abc404eb73cb8ffa4efb906fd400e476b',1,'std::unordered_multiset::operator=(unordered_multiset &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#adfc21fb29e21a666c726325bdbab7fd8',1,'std::unordered_multiset::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a28b4eb4e12733c87d05ecd05c23e4269',1,'std::unordered_set::operator=(const unordered_set &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae40948838a04772d6e2e0281ccbde1f3',1,'std::unordered_set::operator=(unordered_set &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a3c34d8e0d4bfc8c91c4b54b5199edc04',1,'std::unordered_set::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafd9682220fbb71cdd3780fb0b80a7840',1,'std::valarray::operator=(const valarray< _Tp > &__v)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0b40ea6b05b21b6506d3541205bbfe64',1,'std::valarray::operator=(valarray< _Tp > &&__v) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga80a24d05a21101fb1e8f32d7617b349a',1,'std::valarray::operator=(const _Tp &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga708c338c38f644c83fb4440add0a7f82',1,'std::valarray::operator=(const slice_array< _Tp > &__sa)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga975285295867516982cbd04e5416ca33',1,'std::valarray::operator=(const gslice_array< _Tp > &__ga)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga008f37655c6e6e55b37c9b46efd259c1',1,'std::valarray::operator=(const mask_array< _Tp > &__ma)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad58ef4619934cdeccb9b476c6e8ccceb',1,'std::valarray::operator=(const indirect_array< _Tp > &__ia)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga781c3cfba5752871b9b8df2717f3d301',1,'std::valarray::operator=(initializer_list< _Tp > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'std::vector::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'std::vector::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'std::vector::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Codecvt >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Codecvt >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Codecvt >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Res_type >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Res_type >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Res_type >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Result< _Res > >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Result< _Res > >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Result< _Res > >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Result_base >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Result_base >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Result_base >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< bool[]>::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< bool[]>::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< bool[]>::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aca0525353d274a1abca19e123ca58702',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator=(const unordered_map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d63494d15ed6c47df072d06d9608ca0',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator=(unordered_map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a46087d4d85698c13e7fe5e10f13821d1',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafd9682220fbb71cdd3780fb0b80a7840',1,'valarray< size_t >::operator=(const valarray< size_t > &__v)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0b40ea6b05b21b6506d3541205bbfe64',1,'valarray< size_t >::operator=(valarray< size_t > &&__v) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga80a24d05a21101fb1e8f32d7617b349a',1,'valarray< size_t >::operator=(const size_t &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga708c338c38f644c83fb4440add0a7f82',1,'valarray< size_t >::operator=(const slice_array< size_t > &__sa)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga975285295867516982cbd04e5416ca33',1,'valarray< size_t >::operator=(const gslice_array< size_t > &__ga)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga008f37655c6e6e55b37c9b46efd259c1',1,'valarray< size_t >::operator=(const mask_array< size_t > &__ma)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad58ef4619934cdeccb9b476c6e8ccceb',1,'valarray< size_t >::operator=(const indirect_array< size_t > &__ia)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga781c3cfba5752871b9b8df2717f3d301',1,'valarray< size_t >::operator=(initializer_list< size_t > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< __diff_type >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< __diff_type >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< __diff_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _CharClassT >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _CharClassT >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _CharClassT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _CharT >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _CharT >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _CharT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _Cmpt >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _Cmpt >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _Cmpt >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _Node *, _Nodeptr_Alloc >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _Node *, _Nodeptr_Alloc >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _Node *, _Nodeptr_Alloc >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _RealType >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _RealType >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _RealType >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _State< _TraitsT::char_type > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _State< _TraitsT::char_type > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _State< _TraitsT::char_type > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _StringT >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _StringT >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _StringT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< block_type, allocator_type >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< block_type, allocator_type >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< block_type, allocator_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< Catalog_info * >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< Catalog_info * >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< Catalog_info * >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< double >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< double >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< double >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< int >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< int >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< int >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< result_type >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< result_type >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< result_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< size_t >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< size_t >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< size_t >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< std::pair< _BiIter, int > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< std::pair< _BiIter, int > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< std::pair< _BiIter, int > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< std::pair< _StateIdT, std::vector > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< std::pair< _StateIdT, std::vector > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< std::pair< _StateIdT, std::vector > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< sub_match< _BiIter >, _Alloc >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< sub_match< _BiIter >, _Alloc >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< sub_match< _BiIter >, _Alloc >::operator=(initializer_list< value_type > __l)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a61747e22cfd8bd36456de2deed877fca',1,'Eigen::AngleAxis::operator=(const MatrixBase< Derived > &mat)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#aa79ba9655d1b8fe12d75082902cea88b',1,'Eigen::AngleAxis::operator=(const QuaternionBase< QuatDerived > &q)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Eigen::Array::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Eigen::Array::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Eigen::Array::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Eigen::Array::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< double, DPARM_SIZE, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< double, DPARM_SIZE, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< double, DPARM_SIZE, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< double, DPARM_SIZE, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< Index, 1, Dynamic >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< Index, 1, Dynamic >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< Index, 1, Dynamic >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< Index, 1, Dynamic >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< int, IPARM_SIZE, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< int, IPARM_SIZE, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< int, IPARM_SIZE, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< int, IPARM_SIZE, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< RealScalar, Dynamic, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< RealScalar, Dynamic, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< RealScalar, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< RealScalar, Dynamic, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< StorageIndex, 2, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< StorageIndex, 2, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< StorageIndex, 2, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< StorageIndex, 2, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a8587d8d893f5225a4511e9d76d9fe3cc',1,'Eigen::ArrayBase::operator=(const ArrayBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a80cacb05b6881fba659efb2377e4fd22',1,'Eigen::ArrayBase::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a8587d8d893f5225a4511e9d76d9fe3cc',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator=(const ArrayBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a80cacb05b6881fba659efb2377e4fd22',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'Eigen::DenseBase::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'Eigen::DenseBase::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'Eigen::DenseBase::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'DenseBase< Solve< Decomposition, RhsType > >::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'DenseBase< Solve< Decomposition, RhsType > >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'DenseBase< Solve< Decomposition, RhsType > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a5d362adc0550baabcff2095c92c5045d',1,'Eigen::DiagonalMatrix::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Eigen::Matrix::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Eigen::Matrix::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Eigen::Matrix::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< RealScalar, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< RealScalar, Dynamic, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< RealScalar, Dynamic, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, 3, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, 3, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, 3, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Dim, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Dim, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Dim, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Dynamic, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Dynamic, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< StorageIndex, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< StorageIndex, Dynamic, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< StorageIndex, Dynamic, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a373bf62ad398162df5a71963ed7cbeff',1,'Eigen::MatrixBase::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a373bf62ad398162df5a71963ed7cbeff',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a373bf62ad398162df5a71963ed7cbeff',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'Eigen::PermutationBase::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'Eigen::PermutationBase::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'Eigen::PermutationMatrix::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'Eigen::PermutationMatrix::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'Eigen::PlainObjectBase::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'Eigen::PlainObjectBase::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'Eigen::QuaternionBase::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'Eigen::QuaternionBase::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a9d3da523c37f4ef0574f35fd7b3b9662',1,'Eigen::Rotation2D::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolExpr.html#a0bd43167911dc398fba4e3f0f142a64d',1,'Eigen::symbolic::SymbolExpr::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a826047489741a19b81c6552f8257b1cf',1,'Eigen::Transform::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a8ed8318285ccc7498197da7df1273bd5',1,'Eigen::Transform::operator=(const QMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a54986164dcb1d0f7bfa216b8ef5272f6',1,'Eigen::Transform::operator=(const QTransform &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a991cbd0dcd647b414bbfdbacb642dbbd',1,'Eigen::Transpositions::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a991cbd0dcd647b414bbfdbacb642dbbd',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a09db8ccbd4b2da7c7e8d520458166cc1',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator=(const MatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a556c7e90c64e86a3a8e722989dda1bc6',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator=(const TriangularBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'Eigen::VectorwiseOp::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Derived, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Derived, Vertical >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a1ae937c299f347a9dcb7f31a8e57762b.html#a1ae937c299f347a9dcb7f31a8e57762b',1,'nlohmann::basic_json::operator=()'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a1a90dae111cf189ac9ad340a60b199b6.html#a1a90dae111cf189ac9ad340a60b199b6',1,'nlohmann::json_sax::operator=(const json_sax &)=default'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_ac74584e3dc41f2465e69b37d7d2bf694.html#ac74584e3dc41f2465e69b37d7d2bf694',1,'nlohmann::json_sax::operator=(json_sax &&) noexcept=default'],['../classcam_1_1CameraParams.html#a7a73a289f11757797b23d816e2561dae',1,'cam::CameraParams::operator=()'],['../classrobot_1_1base__motor.html#a354ebc41c91a7f98c7b3b8cf8bfd145f',1,'robot::base_motor::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9451cdb3a66bebcc1f5e8b409f780b7f',1,'operator=(const softfloat &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf80704eb7bfc3257da30ad5a82fb9de',1,'operator=(const softdouble &c)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga92ff752125c60794c33d55db59b48105',1,'operator=(const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaebc147a1a3a6e326215cd323aafa6bc6',1,'operator=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf25507c9a66f729500964d397b7cb9fb',1,'operator=(const gslice_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga73cce032d98e922eeafb676920174f52',1,'operator=(const indirect_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac8928f66422bd3601fcf43b79761abd5',1,'operator=(const mask_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf2a0c3883cfb758e05e3d62ec7e0a07f',1,'operator=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga59fd646ebf243e99b2063baf37ba91d0',1,'operator=(const gslice &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8dfed8c043d7a82e4b71cf65c64ec844',1,'operator=(const _Tp &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga638dcc09b7202f5e671c6637bf01db31',1,'operator=(const slice_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0b40ea6b05b21b6506d3541205bbfe64',1,'operator=(valarray< _Tp > &&__v) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga708c338c38f644c83fb4440add0a7f82',1,'operator=(const slice_array< _Tp > &__sa)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga975285295867516982cbd04e5416ca33',1,'operator=(const gslice_array< _Tp > &__ga)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga008f37655c6e6e55b37c9b46efd259c1',1,'operator=(const mask_array< _Tp > &__ma)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad58ef4619934cdeccb9b476c6e8ccceb',1,'operator=(const indirect_array< _Tp > &__ia)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga781c3cfba5752871b9b8df2717f3d301',1,'operator=(initializer_list< _Tp > __l)(Global Namespace)']]], + ['operator_3d_3d_328',['operator==',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#acf112fc545f9775e075edc49aba223c4',1,'cv::FileNodeIterator::operator==(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#acf112fc545f9775e075edc49aba223c4',1,'cv::FileNodeIterator::operator==(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/dd5/structcv_1_1GArrayDesc.html#aa68591702df8e965af25f67215b9a025',1,'cv::GArrayDesc::operator==()'],['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html#aa6626bdd5f1f55a5f29bad91cf8b891b',1,'cv::gapi::GBackend::operator==()'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a15c5b7fd785e239a1863f4658c1c53ac',1,'cv::GMatDesc::operator==()'],['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#a1f2bff8899fd6b72e574d48194bf283b',1,'cv::optflow::GPCTree::operator==()'],['https://docs.opencv.org/4.2.0/d1/d6a/structcv_1_1GScalarDesc.html#a36bdb1c38855e657126b600da4befb61',1,'cv::GScalarDesc::operator==()'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a90841129d2fa56dc7713e51d668dd8b5',1,'cv::linemod::Match::operator==()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0f25efd0c1f254692fc60bda5f4c3353',1,'cv::MatExpr::operator==(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5516de530ce49cf1fdbfcedbc13fa64d',1,'cv::MatExpr::operator==(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2c23e8205bea3a64497638fe270e3a83',1,'cv::MatExpr::operator==(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab9e92650570e38003f74364c0d168157',1,'cv::MatExpr::operator==(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abb139508b5df77d1009612b438f53df5',1,'cv::MatExpr::operator==(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0f25efd0c1f254692fc60bda5f4c3353',1,'cv::MatExpr::operator==(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5516de530ce49cf1fdbfcedbc13fa64d',1,'cv::MatExpr::operator==(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2c23e8205bea3a64497638fe270e3a83',1,'cv::MatExpr::operator==(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab9e92650570e38003f74364c0d168157',1,'cv::MatExpr::operator==(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abb139508b5df77d1009612b438f53df5',1,'cv::MatExpr::operator==(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#ae19097bf50bc486e072f340a295adb64',1,'cv::MatSize::operator==()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'cv::Matx::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'cv::Matx::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< _Tp, cn, 1 >::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< _Tp, cn, 1 >::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 1, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 1, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 2 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 2 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 4, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 4, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, cn, 1 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, cn, 1 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 2, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 2, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 3, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 3, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, cn, 1 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, cn, 1 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float_type, 4, 4 >::operator==(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float_type, 4, 4 >::operator==(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/d8/dde/structNcvSize32u.html#a447699c291cd1eb0786f1ee3b1570fb6',1,'NcvSize32u::operator==()'],['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#a30538c00fc6f3108318e8dea59aca435',1,'cv::optflow::GPCTree::Node::operator==()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a6c4889ee703a2b667df1fa298ffa312f',1,'cv::RNG::operator==()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga972dee821ab26d61f11528b427131083',1,'cv::softdouble::operator==()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf9ae987f5788edbe1aada59dd7f41717',1,'cv::softfloat::operator==()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a22b988f35c68ef6dda4395640dd00d45',1,'cv::util::variant::operator=='],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a22b988f35c68ef6dda4395640dd00d45',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7acc944a17c34a7e6a1f46a18319abe7',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7acc944a17c34a7e6a1f46a18319abe7',1,'__gnu_pbds::detail::bin_search_tree_node_it_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#a49be997a654cf31a5688f876b3a0926b',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator==(const binary_heap_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a086ba257226b242633bc6519023da110',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator==(const binary_heap_point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a086ba257226b242633bc6519023da110',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#ae75829a8ccd781a3914acd4e19e3ce3e',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator==(const left_child_next_sibling_heap_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a0a47dab89d7acfb414046e40887e3064',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator==(const left_child_next_sibling_heap_node_point_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a0a47dab89d7acfb414046e40887e3064',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a46409e64d8adbfd9be6a641313d150da',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a46409e64d8adbfd9be6a641313d150da',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a71de2ddc1c6ba25e6e272c9da3a95318',1,'const_iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a866b2f6450ebeaa95ed1b6065451ad7d',1,'const_iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ab60504a4db8724aede12258da566aede',1,'gamma_distribution< double >::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ab60504a4db8724aede12258da566aede',1,'gamma_distribution< result_type >::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a71de2ddc1c6ba25e6e272c9da3a95318',1,'iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a866b2f6450ebeaa95ed1b6065451ad7d',1,'iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a96c6f6aabca5106a2db6ecc834bbddfe',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#afaafdb22ede1508109622f89f50e213d',1,'normal_distribution< double >::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#afaafdb22ede1508109622f89f50e213d',1,'normal_distribution< result_type >::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a71de2ddc1c6ba25e6e272c9da3a95318',1,'point_const_iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a866b2f6450ebeaa95ed1b6065451ad7d',1,'point_const_iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#adfa598f9d27ae43c69743fa39fd49a05',1,'point_iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#aa326cdd6985b3c513e13027a420cc8d8',1,'point_iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05507.html#a3c683932c804fc4b5bc8fe9fd379733b',1,'std::_Fwd_list_const_iterator::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05503.html#a3c683932c804fc4b5bc8fe9fd379733b',1,'std::_Fwd_list_iterator::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#a30ec495579b2c991c5eb5259ad4f1704',1,'std::bernoulli_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a98cae54fe8bdfb6ad29aa3577b02e50c',1,'std::binomial_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#affef282a5c1dde27d67a3ad667936c17',1,'std::bitset::operator==(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#affef282a5c1dde27d67a3ad667936c17',1,'std::bitset::operator==(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#a9df65ecb32574bdf021bd67b12ad772f',1,'std::cauchy_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a691feda4d6a0dec975dbe07c838768b6',1,'std::chi_squared_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#aa991a227519aedc1fb7b50798612f94c',1,'std::discard_block_engine::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a61bdfdd7dbb86dc1e5b16f008f9131ae',1,'std::discrete_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#acb5724229a97210048c27dba8f3a50b4',1,'std::exponential_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#afdd72be1506ac50b8909ca3cb57b8bfa',1,'std::extreme_value_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a6d91b2687b4f8cc34d02a65b739ed070',1,'std::fisher_f_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ab60504a4db8724aede12258da566aede',1,'std::gamma_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a63cafb50acfe1b10c4a26cd6c990bc3f',1,'std::geometric_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#ab5791f2acb5c5700ef1e339bfc166d89',1,'std::independent_bits_engine::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#ab062526efb78cd1480aff1eb1544b341',1,'std::linear_congruential_engine::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a0f58972cf0b98da7d1e751bba3f28f7e',1,'std::locale::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#a2e49cbc5eaeb0e2ee18688adb7faff49',1,'std::lognormal_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a96c6f6aabca5106a2db6ecc834bbddfe',1,'std::mersenne_twister_engine::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#ae83e101d008cf6d901327839147b59e8',1,'std::negative_binomial_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#afaafdb22ede1508109622f89f50e213d',1,'std::normal_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a8f919cbe6f2774eb3102708b0590c706',1,'std::piecewise_constant_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#aaecc7ad95a1725574e6beae781d34127',1,'std::piecewise_linear_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a97a69ac6a7f5db9c986887cac931ce85',1,'std::poisson_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#adb0c9c95d8d972b0f68da2b1740bbc14',1,'std::regex_iterator::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a075cbb0e00f38573d223b5590ac9c438',1,'std::regex_token_iterator::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#ac60decfccc6547c45fe37a9cf0cb23f0',1,'std::shuffle_order_engine::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a50ff04920a1b422339cdf87368d1bb36',1,'std::student_t_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#aad723b232704ecb9396af450f399eb1f',1,'std::subtract_with_carry_engine::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a7f0e34979e94f5145c2092483ee0fca9',1,'std::uniform_int_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#a97a14cea3172313b1d430685a13e3dee',1,'std::uniform_real_distribution::operator=='],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a8089e164041723abdb970621d267e7d5',1,'std::weibull_distribution::operator=='],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a80e3e1e83fdf43f9f7fb6ff51836b24d',1,'Eigen::MatrixBase::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a80e3e1e83fdf43f9f7fb6ff51836b24d',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a80e3e1e83fdf43f9f7fb6ff51836b24d',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'Eigen::QuaternionBase::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator==()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a122640e7e2db1814fc7bbb3c122ec76e.html#a122640e7e2db1814fc7bbb3c122ec76e',1,'nlohmann::basic_json::operator=='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a107a085c92ec4e062d1185b2d09c7978.html#a107a085c92ec4e062d1185b2d09c7978',1,'nlohmann::basic_json::operator=='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a24ae7acd5b06ae49cfe1c94633436b68.html#a24ae7acd5b06ae49cfe1c94633436b68',1,'nlohmann::basic_json::operator=='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_aee67fde9d3d571a07d5bb35df21c0555.html#aee67fde9d3d571a07d5bb35df21c0555',1,'nlohmann::byte_container_with_subtype::operator==()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a4667ef558c8c3f8a646bfda0c6654653.html#a4667ef558c8c3f8a646bfda0c6654653',1,'nlohmann::json_pointer::operator=='],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga265437a0b1f89bf8f23abfc7a4851fe7',1,'cv::operator==()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ef7d0ea1a3ab83c7f256519308a844',1,'cv::cudev::operator==(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c03cd29116a3881ded8063f7b2ba14f',1,'cv::cudev::operator==(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f3a2eceff62c03cd9a882415b1c3f0',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a4d2f075d535c3ff86c0b6bf318e72',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c672631285cf71d4d1d4dbe0efce11f',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4251ba200887d1621e3666dab16287ab',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa06c320c4bd4a2b17768c4139c1a6293',1,'cv::cudev::operator==(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga528b1ebd894984f8761e8b8d88032fa7',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga911a544f2ecd6917b6b4e401bee9d8a5',1,'cv::cudev::operator==(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5dae5116c781ee0064d66d54eb3156d',1,'cv::cudev::operator==(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabc05ae0491425089c125d9df1d4cf71',1,'cv::cudev::operator==(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e265e4d4ec9c9ea2d10b024fa2ad5d5',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3176752b40d5162d7960321c5862a1a',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88f39c819d520a99b1e101b22de693ce',1,'cv::cudev::operator==(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf424cb9b34f4e8037d63be9ac57eacb8',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42690ed246813e13156ee7a94a6edfb8',1,'cv::cudev::operator==(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c2d540d34347146ca6fd7fc13362f18',1,'cv::cudev::operator==(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca47f7f9407e6fd8424aebc82a811283',1,'cv::cudev::operator==(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf63eee75bc9dfcd335ee6100a0ab2b6',1,'cv::cudev::operator==(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d000c2d62a0a2feb023cfce8912b2ef',1,'cv::cudev::operator==(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7b6cc4a40099563d92a21677659e0',1,'cv::cudev::operator==(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10206e51eb5cf79fc73525e83b18b74a',1,'cv::cudev::operator==(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3fb8521b5e67d3ff9ab4a7e1afad12',1,'cv::cudev::operator==(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fc754b6f5b8565f33507efb2275bfb6',1,'cv::cudev::operator==(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be39f600250879de5101123b66504b8',1,'cv::cudev::operator==(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfb79324be9e683545bb7002bc4ab28',1,'cv::cudev::operator==(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ee6639a7f89d8f34c3c6ef3612549c1',1,'cv::cudev::operator==(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4f48f70be081aacfd902bedf1e51fe',1,'cv::cudev::operator==(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c4da213e91b805e976aa524c708c00',1,'cv::cudev::operator==(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56c8ff40e1386ced3569766a16d8d4f',1,'cv::cudev::operator==(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7fd7e441fa19fc3d30891d4a72dd3d',1,'cv::cudev::operator==(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05bbbea75bff44d625777a0f747fa3d8',1,'cv::cudev::operator==(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga792515f0fb51d1d5ec3909796ca83210',1,'cv::cudev::operator==(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b07bce720a1685cb83bf8f41013a25f',1,'cv::cudev::operator==(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18dff9db2290860f6cc90b61deaa1b30',1,'cv::cudev::operator==(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b545fa1278af6ad8c1d637d3177eb10',1,'cv::cudev::operator==(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d099a82124c0e33bdcc5d5e74eaebb2',1,'cv::cudev::operator==(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6783ef41308862477ba5314de3e69d0',1,'cv::cudev::operator==(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4ed94a65ade2bd611d9abb6706e4a2c',1,'cv::cudev::operator==(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac651885fe279e2497a477cbfc1ede96f',1,'cv::cudev::operator==(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2039c53f02ea2409638a50ef3c6be3e',1,'cv::cudev::operator==(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga896fedd904924b35b5d2afcae58f3a0c',1,'cv::cudev::operator==(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cac30ae19e5ed19d98562f0dab48191',1,'cv::cudev::operator==(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeda02a903e1895363cf991717900cd5c',1,'cv::cudev::operator==(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35df58b1d78944360c0d0a1f79eaf903',1,'cv::cudev::operator==(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba49598153961051c9ddf282d36acf2',1,'cv::cudev::operator==(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dd4f1bc3a106a0ae0c8a202dc9b289e',1,'cv::cudev::operator==(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08afcea4414c4e8448351d208645e1d2',1,'cv::cudev::operator==(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa536847ec326ee826054043706320926',1,'cv::cudev::operator==(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1858de8e86a7d74dd5696a3da6622f00',1,'cv::cudev::operator==(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d443a79fa65df214fb74a750765eb33',1,'cv::cudev::operator==(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101069df9b8c98db50d7723eb2452905',1,'cv::cudev::operator==(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f964ff73b6a52ccbeef211ae1202c8',1,'cv::cudev::operator==(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52ca12e909e8009d33d169cc954eb8e6',1,'cv::cudev::operator==(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b6072969257533c8b1c24ae3a35c9a1',1,'cv::cudev::operator==(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59cdc36df6f9053bc413dd3a92522ba3',1,'cv::cudev::operator==(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga666c44211474c9a295525bca03433cee',1,'cv::cudev::operator==(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaea9ab37e1f2dd66c45b3283de613cbd',1,'cv::cudev::operator==(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56b745a12912d7e0b7ae22fd6297902',1,'cv::cudev::operator==(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e9304361fccde39db1ab2ae0c07f68',1,'cv::cudev::operator==(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec3b2bf74cd4ff6af94bb83bdf8783b4',1,'cv::cudev::operator==(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga128ceaedc10a626785f8ce09f554198a',1,'cv::cudev::operator==(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81f8f4793ee7c514eca370438997eb45',1,'cv::cudev::operator==(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1329e50637b7b5ac07100d3e263331d',1,'cv::cudev::operator==(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78683b47cb3562be1f4d48606497e409',1,'cv::cudev::operator==(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa32ae379c00e669b968b3090cd815e2a',1,'cv::cudev::operator==(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29a49819fa81a12fdb40418ecfed5085',1,'cv::cudev::operator==(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f3770d45d2f2184aefca17515d82fc8',1,'cv::cudev::operator==(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36065bc2f0c37455244db7f412296a59',1,'cv::cudev::operator==(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1c6ff78a4c2957eb469cce1e0d9892b',1,'cv::cudev::operator==(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24b60bc88c8796c3b7d230868e9d1e65',1,'cv::cudev::operator==(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0cf450da39a02ef534f92365e71eef9',1,'cv::cudev::operator==(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d7fcd75c972fae50f91d56bd0f815a',1,'cv::cudev::operator==(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dcbfffb2623cdd808a82387de219fdb',1,'cv::cudev::operator==(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76e79f2930fab6ae0c14b89445494a83',1,'cv::cudev::operator==(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3cb39b62df9f3c283aa768412fda24bc',1,'cv::cudev::operator==(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4940b8cdca244cec798fc5e12b96ed8e',1,'cv::cudev::operator==(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c906fac8d8e04f4c1b62ba525fd1617',1,'cv::cudev::operator==(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12c2c61f6d87749a497db6cb678835db',1,'cv::cudev::operator==(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd318fb104522620d4d12b98b93c8974',1,'cv::cudev::operator==(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff38bcfdc1dca4e5abfac0ca3b117fc',1,'cv::cudev::operator==(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ba83f60df077bb1b5654a2ee1afb367',1,'cv::cudev::operator==(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ec516b24d0b6b66b6419089b9bc0713',1,'cv::cudev::operator==(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c31130c36dc9b842e26fdaf680e00b6',1,'cv::cudev::operator==(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b31d6c71170412cae5061aa6ac19442',1,'cv::cudev::operator==(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecc2ba37fea0d1d795a2cab8ece45cc1',1,'cv::cudev::operator==(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e7ea06c654354b984128255037d55fd',1,'cv::cudev::operator==(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf30eab4cac32df44e33444bfe7b0070',1,'cv::cudev::operator==(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb69979b7b37bfd566ca1ab2da349c98',1,'cv::cudev::operator==(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7697781422bbb9de18a582f93388324c',1,'cv::cudev::operator==(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46152b0d4aabffb4ca701da3b541068b',1,'cv::cudev::operator==(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6fbc5b8438fe5bea85238b9d0c5f3e',1,'cv::cudev::operator==(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade08fcc308b2e20d50c4a3438fe4b6ee',1,'cv::cudev::operator==(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae34b2a72fe4150e858465a7769ee2c52',1,'cv::cudev::operator==(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0c0ceb6055acb375303cecd49634749',1,'cv::cudev::operator==(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3eff50212ed2892cd6fe4b8d19dd3a2a',1,'cv::cudev::operator==(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga853c4c648ea2ed3ba048ed254fa6f394',1,'cv::cudev::operator==(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96ad2da041f97e4dc0ea14e0da62fe96',1,'cv::cudev::operator==(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5346316989e032dda02d05565286aba1',1,'cv::cudev::operator==(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80fad755179790ebd605e94301d180ef',1,'cv::cudev::operator==(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3123a45c875b4eb9a41975aa969b6db5',1,'cv::cudev::operator==(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63e43865abdcf4a38d39a5eb89729f63',1,'cv::cudev::operator==(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5a0f9e14535efa9de7e727cef2f9bcd',1,'cv::cudev::operator==(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa49d3faa449c6996a36b4cfe9bc746e7',1,'cv::cudev::operator==(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89677a515b08e742fc50a35d1798fc03',1,'cv::cudev::operator==(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9447ed9200cf81281050367c324bdf10',1,'cv::cudev::operator==(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabee6ab2431bb58230e98a0ede9c6d337',1,'cv::cudev::operator==(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42afbc516bbfa01e1310a9bab908702',1,'cv::cudev::operator==(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0a74127fa51af116df67364acd93bd3',1,'cv::cudev::operator==(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e730bd659adc74654d92449dad36b9d',1,'cv::cudev::operator==(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga346d65131b0e3c9e3ac61de5176606a8',1,'cv::cudev::operator==(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa30c0df3a7b04d70749c2ab8b6fff5fe',1,'cv::cudev::operator==(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec539fea1d620f685a11e9d391f78afd',1,'cv::cudev::operator==(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b435363def80bdc86a9841a802a2ca',1,'cv::cudev::operator==(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1153ecbaadb6527bf4913cc87d984850',1,'cv::cudev::operator==(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9127ac6fce50f851f7d47463fa632fbf',1,'cv::cudev::operator==(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga612438c13d01ed44d78967a7febf0eb0',1,'cv::cudev::operator==(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00a17f5eee9ac60ccb1ababf1fd1e73b',1,'cv::cudev::operator==(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd8701578ccdf15bc6cbb4d3d5517c9',1,'cv::cudev::operator==(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2bb15eb31a7a24d0434a3a131d06d8',1,'cv::cudev::operator==(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/d0/d1a/namespacecv_1_1gapi_1_1fluid.html#a10b8ba4730d3e056eb20a3ec7b1cee96',1,'cv::gapi::fluid::operator==()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#adc6dd73da3e9d530ba62bb4de813ce59',1,'cv::gapi::own::operator==(const Scalar &lhs, const Scalar &rhs)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a67f8ec451661ed549feca91a814d84e9',1,'cv::gapi::own::operator==(const Rect &lhs, const Rect &rhs)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#aa2f43bcd90b89230eadc4556a534cf0d',1,'cv::gapi::own::operator==(const Size &lhs, const Size &rhs)'],['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a3025fa7e3d6892a5ee2144bf3b564c22',1,'cv::instr::operator==()'],['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#ad1e6cef1a8e7e7dbed38321d38691c9d',1,'cv::tbm::operator==()'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a4d75335a7cc12c0d62a854c9151e02d2',1,'cv::util::operator==(const util::monostate &, const util::monostate &)'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a671a36e09de46881212b09f980d86b00',1,'cv::util::operator==(const variant< Us... > &lhs, const variant< Us... > &rhs)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf9ae987f5788edbe1aada59dd7f41717',1,'operator==(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga972dee821ab26d61f11528b427131083',1,'operator==(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga265437a0b1f89bf8f23abfc7a4851fe7',1,'operator==(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ef7d0ea1a3ab83c7f256519308a844',1,'operator==(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c03cd29116a3881ded8063f7b2ba14f',1,'operator==(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f3a2eceff62c03cd9a882415b1c3f0',1,'operator==(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a4d2f075d535c3ff86c0b6bf318e72',1,'operator==(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c672631285cf71d4d1d4dbe0efce11f',1,'operator==(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4251ba200887d1621e3666dab16287ab',1,'operator==(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa06c320c4bd4a2b17768c4139c1a6293',1,'operator==(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga528b1ebd894984f8761e8b8d88032fa7',1,'operator==(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga911a544f2ecd6917b6b4e401bee9d8a5',1,'operator==(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5dae5116c781ee0064d66d54eb3156d',1,'operator==(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabc05ae0491425089c125d9df1d4cf71',1,'operator==(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e265e4d4ec9c9ea2d10b024fa2ad5d5',1,'operator==(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3176752b40d5162d7960321c5862a1a',1,'operator==(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88f39c819d520a99b1e101b22de693ce',1,'operator==(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf424cb9b34f4e8037d63be9ac57eacb8',1,'operator==(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42690ed246813e13156ee7a94a6edfb8',1,'operator==(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c2d540d34347146ca6fd7fc13362f18',1,'operator==(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca47f7f9407e6fd8424aebc82a811283',1,'operator==(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf63eee75bc9dfcd335ee6100a0ab2b6',1,'operator==(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d000c2d62a0a2feb023cfce8912b2ef',1,'operator==(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7b6cc4a40099563d92a21677659e0',1,'operator==(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10206e51eb5cf79fc73525e83b18b74a',1,'operator==(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3fb8521b5e67d3ff9ab4a7e1afad12',1,'operator==(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fc754b6f5b8565f33507efb2275bfb6',1,'operator==(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be39f600250879de5101123b66504b8',1,'operator==(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfb79324be9e683545bb7002bc4ab28',1,'operator==(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ee6639a7f89d8f34c3c6ef3612549c1',1,'operator==(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4f48f70be081aacfd902bedf1e51fe',1,'operator==(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c4da213e91b805e976aa524c708c00',1,'operator==(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56c8ff40e1386ced3569766a16d8d4f',1,'operator==(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7fd7e441fa19fc3d30891d4a72dd3d',1,'operator==(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05bbbea75bff44d625777a0f747fa3d8',1,'operator==(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga792515f0fb51d1d5ec3909796ca83210',1,'operator==(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b07bce720a1685cb83bf8f41013a25f',1,'operator==(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18dff9db2290860f6cc90b61deaa1b30',1,'operator==(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b545fa1278af6ad8c1d637d3177eb10',1,'operator==(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d099a82124c0e33bdcc5d5e74eaebb2',1,'operator==(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6783ef41308862477ba5314de3e69d0',1,'operator==(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4ed94a65ade2bd611d9abb6706e4a2c',1,'operator==(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac651885fe279e2497a477cbfc1ede96f',1,'operator==(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2039c53f02ea2409638a50ef3c6be3e',1,'operator==(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga896fedd904924b35b5d2afcae58f3a0c',1,'operator==(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cac30ae19e5ed19d98562f0dab48191',1,'operator==(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeda02a903e1895363cf991717900cd5c',1,'operator==(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35df58b1d78944360c0d0a1f79eaf903',1,'operator==(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba49598153961051c9ddf282d36acf2',1,'operator==(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dd4f1bc3a106a0ae0c8a202dc9b289e',1,'operator==(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08afcea4414c4e8448351d208645e1d2',1,'operator==(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa536847ec326ee826054043706320926',1,'operator==(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1858de8e86a7d74dd5696a3da6622f00',1,'operator==(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d443a79fa65df214fb74a750765eb33',1,'operator==(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101069df9b8c98db50d7723eb2452905',1,'operator==(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f964ff73b6a52ccbeef211ae1202c8',1,'operator==(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52ca12e909e8009d33d169cc954eb8e6',1,'operator==(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b6072969257533c8b1c24ae3a35c9a1',1,'operator==(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59cdc36df6f9053bc413dd3a92522ba3',1,'operator==(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga666c44211474c9a295525bca03433cee',1,'operator==(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaea9ab37e1f2dd66c45b3283de613cbd',1,'operator==(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56b745a12912d7e0b7ae22fd6297902',1,'operator==(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e9304361fccde39db1ab2ae0c07f68',1,'operator==(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec3b2bf74cd4ff6af94bb83bdf8783b4',1,'operator==(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga128ceaedc10a626785f8ce09f554198a',1,'operator==(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81f8f4793ee7c514eca370438997eb45',1,'operator==(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1329e50637b7b5ac07100d3e263331d',1,'operator==(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78683b47cb3562be1f4d48606497e409',1,'operator==(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa32ae379c00e669b968b3090cd815e2a',1,'operator==(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29a49819fa81a12fdb40418ecfed5085',1,'operator==(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f3770d45d2f2184aefca17515d82fc8',1,'operator==(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36065bc2f0c37455244db7f412296a59',1,'operator==(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1c6ff78a4c2957eb469cce1e0d9892b',1,'operator==(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24b60bc88c8796c3b7d230868e9d1e65',1,'operator==(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0cf450da39a02ef534f92365e71eef9',1,'operator==(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d7fcd75c972fae50f91d56bd0f815a',1,'operator==(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dcbfffb2623cdd808a82387de219fdb',1,'operator==(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76e79f2930fab6ae0c14b89445494a83',1,'operator==(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3cb39b62df9f3c283aa768412fda24bc',1,'operator==(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4940b8cdca244cec798fc5e12b96ed8e',1,'operator==(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c906fac8d8e04f4c1b62ba525fd1617',1,'operator==(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12c2c61f6d87749a497db6cb678835db',1,'operator==(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd318fb104522620d4d12b98b93c8974',1,'operator==(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff38bcfdc1dca4e5abfac0ca3b117fc',1,'operator==(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ba83f60df077bb1b5654a2ee1afb367',1,'operator==(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ec516b24d0b6b66b6419089b9bc0713',1,'operator==(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c31130c36dc9b842e26fdaf680e00b6',1,'operator==(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b31d6c71170412cae5061aa6ac19442',1,'operator==(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecc2ba37fea0d1d795a2cab8ece45cc1',1,'operator==(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e7ea06c654354b984128255037d55fd',1,'operator==(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf30eab4cac32df44e33444bfe7b0070',1,'operator==(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb69979b7b37bfd566ca1ab2da349c98',1,'operator==(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7697781422bbb9de18a582f93388324c',1,'operator==(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46152b0d4aabffb4ca701da3b541068b',1,'operator==(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6fbc5b8438fe5bea85238b9d0c5f3e',1,'operator==(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade08fcc308b2e20d50c4a3438fe4b6ee',1,'operator==(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae34b2a72fe4150e858465a7769ee2c52',1,'operator==(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0c0ceb6055acb375303cecd49634749',1,'operator==(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3eff50212ed2892cd6fe4b8d19dd3a2a',1,'operator==(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga853c4c648ea2ed3ba048ed254fa6f394',1,'operator==(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96ad2da041f97e4dc0ea14e0da62fe96',1,'operator==(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5346316989e032dda02d05565286aba1',1,'operator==(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80fad755179790ebd605e94301d180ef',1,'operator==(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3123a45c875b4eb9a41975aa969b6db5',1,'operator==(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63e43865abdcf4a38d39a5eb89729f63',1,'operator==(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5a0f9e14535efa9de7e727cef2f9bcd',1,'operator==(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa49d3faa449c6996a36b4cfe9bc746e7',1,'operator==(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89677a515b08e742fc50a35d1798fc03',1,'operator==(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9447ed9200cf81281050367c324bdf10',1,'operator==(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabee6ab2431bb58230e98a0ede9c6d337',1,'operator==(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42afbc516bbfa01e1310a9bab908702',1,'operator==(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0a74127fa51af116df67364acd93bd3',1,'operator==(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e730bd659adc74654d92449dad36b9d',1,'operator==(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga346d65131b0e3c9e3ac61de5176606a8',1,'operator==(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa30c0df3a7b04d70749c2ab8b6fff5fe',1,'operator==(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec539fea1d620f685a11e9d391f78afd',1,'operator==(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b435363def80bdc86a9841a802a2ca',1,'operator==(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1153ecbaadb6527bf4913cc87d984850',1,'operator==(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9127ac6fce50f851f7d47463fa632fbf',1,'operator==(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga612438c13d01ed44d78967a7febf0eb0',1,'operator==(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00a17f5eee9ac60ccb1ababf1fd1e73b',1,'operator==(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd8701578ccdf15bc6cbb4d3d5517c9',1,'operator==(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2bb15eb31a7a24d0434a3a131d06d8',1,'operator==(double s, const double1 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ae7f71d536da5bf14e2d75305b4b88da5',1,'__gnu_cxx::operator==(const _Pointer_adapter< _Tp > &__lhs, const _Pointer_adapter< _Tp > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#acbaf9ba3f0e9c26a8239a313ad714fa8',1,'__gnu_cxx::operator==(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ad0ff7d116cd8134193d3d843552d750c',1,'__gnu_cxx::operator==(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a20ca06133e85c3a0ea49857488a5b94c',1,'__gnu_cxx::operator==(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga0431ac39f84ec7f88d6bdb9db72bd5b9',1,'std::operator==(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a50d898f211d37c5a47907f462b0b17f1',1,'std::operator==(const fpos< _StateT > &__lhs, const fpos< _StateT > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a05fbef1e7e15558f5933ed15a339e97d',1,'std::operator==(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#gaadf1270d8fcc1bdae9a699e3d85c7986',1,'std::operator==(const reverse_iterator< _Iterator > &__x, const reverse_iterator< _Iterator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7aeb223367d887a2b7f358a50e15e6f2',1,'std::operator==(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga5559f33b5ba6dbf83e961888d324dd40',1,'std::operator==(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad2629e7ee31ca36d6d593639e698db6b',1,'std::operator==(const function< _Res(_Args...)> &__f, nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a225870d9721816ebaa535af4e19d0cc1',1,'std::operator==(nullptr_t, const function< _Res(_Args...)> &__f) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ada60c841e9fe08814304ae79d35267de',1,'std::operator==(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aeed20ec23d92debc5bd1a0c0ee6c1b52',1,'std::operator==(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga89f3784efc6a944b4857408f1fcf7f3b',1,'std::operator==(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga811c7e6a67b83ef003e899c4ea93b910',1,'std::operator==(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d6c242794f6d1866eb9cc58678ce8b1',1,'std::operator==(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae583f778cadadef72db1f8afaa7bc4a1',1,'std::operator==(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga472d58de0896c76b3d402dbf27aa75c8',1,'std::operator==(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae4390d0b1712ee5334c61da6e0576d08',1,'std::operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga51b1c9a2beb5254d11c13dbc22a8e379',1,'std::operator==(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ada41d3682184f0d0d8525907fdfcbea8',1,'std::operator==(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2cc59dba70d0427b9e006411b37aee81',1,'std::operator==(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaac6078c1098e92d740d6d226f1c5e3dd',1,'std::operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa823b88deb57ba1b2494ea0dbcc028a8',1,'std::operator==(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa2053d06d62313a4cde70f0f1d1f04c0',1,'std::operator==(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafcc9a7386753edf6a626ce090f9d4cd3',1,'std::operator==(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a60c2de42339c226dbeaeb60ef54b7bd2',1,'std::operator==(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a648834d2b253af7787093fe9156662f5',1,'std::operator==(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aecebb49b7915414fe7fd3eaff7c8516c',1,'std::operator==(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4edac9ce553e84f7c97c02172d93424e',1,'std::operator==(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaca932655bd64e8b079c145921e0d1d62',1,'std::operator==(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5bbecf180e08f24cdb60411af07873be',1,'std::operator==(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga8ce82b2067ebaf21931151dfee549f0d',1,'std::operator==(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaca932655bd64e8b079c145921e0d1d62',1,'operator==(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5bbecf180e08f24cdb60411af07873be',1,'operator==(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga8ce82b2067ebaf21931151dfee549f0d',1,'operator==(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga0431ac39f84ec7f88d6bdb9db72bd5b9',1,'operator==(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#gaadf1270d8fcc1bdae9a699e3d85c7986',1,'operator==(const reverse_iterator< _Iterator > &__x, const reverse_iterator< _Iterator > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga89f3784efc6a944b4857408f1fcf7f3b',1,'operator==(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga811c7e6a67b83ef003e899c4ea93b910',1,'operator==(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae583f778cadadef72db1f8afaa7bc4a1',1,'operator==(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga472d58de0896c76b3d402dbf27aa75c8',1,'operator==(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae4390d0b1712ee5334c61da6e0576d08',1,'operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga51b1c9a2beb5254d11c13dbc22a8e379',1,'operator==(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaac6078c1098e92d740d6d226f1c5e3dd',1,'operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafcc9a7386753edf6a626ce090f9d4cd3',1,'operator==(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga5559f33b5ba6dbf83e961888d324dd40',1,'operator==(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], + ['operator_3e_329',['operator>',['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html#a02573cd46ba9f4cf2fa8e7b40cde41df',1,'cv::detail::GraphEdge::operator>()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a85401ad9773e0afda99ae87137f26b6d',1,'cv::MatExpr::operator>(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae14822d723b02a44dcc6b9dc66b9d2d6',1,'cv::MatExpr::operator>(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#affc3d68c3891df1237e9a9bd96856c8c',1,'cv::MatExpr::operator>(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a35767a6160d961e75fbc3613e1b9f0a5',1,'cv::MatExpr::operator>(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a28ec289f14a0c25c6e9d1a596318ede3',1,'cv::MatExpr::operator>(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a85401ad9773e0afda99ae87137f26b6d',1,'cv::MatExpr::operator>(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae14822d723b02a44dcc6b9dc66b9d2d6',1,'cv::MatExpr::operator>(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#affc3d68c3891df1237e9a9bd96856c8c',1,'cv::MatExpr::operator>(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a35767a6160d961e75fbc3613e1b9f0a5',1,'cv::MatExpr::operator>(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a28ec289f14a0c25c6e9d1a596318ede3',1,'cv::MatExpr::operator>(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga89a6048ae27277f5f84458078a447a7b',1,'cv::softdouble::operator>()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9e6bd3f5911bf05d858b143d76813b13',1,'cv::softfloat::operator>()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a87db51b6b936fb2ea293cdbc8702dcb8.html#a87db51b6b936fb2ea293cdbc8702dcb8',1,'nlohmann::basic_json::operator>'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9ea8e0e86820fcb3ab0fc937d41226e7.html#a9ea8e0e86820fcb3ab0fc937d41226e7',1,'nlohmann::basic_json::operator>'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a67771044f08fd07105b34667615d9e0e.html#a67771044f08fd07105b34667615d9e0e',1,'nlohmann::basic_json::operator>'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga53b1ef03655e02eabf49238a5927f384',1,'cv::operator>()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf76a5cbe9661c03341fed10338283b3a',1,'cv::cudev::operator>(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35b979bc99aa0c19b8b03d0191c0aef',1,'cv::cudev::operator>(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fe6218c267adf7bf750b607bcee1dde',1,'cv::cudev::operator>(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557a3a12df84d433097b5f1df0d7d04',1,'cv::cudev::operator>(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga192ad383159b69ca2292f072b38508f9',1,'cv::cudev::operator>(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd71f8794eb458670da81e6e31ebd40d',1,'cv::cudev::operator>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga805cfea7bfd59489c103d6ea068e5dd8',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga876bfb5116ae02ad4707fb201477a535',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58c9c31838a279487423f7f3582c4913',1,'cv::cudev::operator>(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c5037a273d23375d3020863519e7732',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81c1cf50caa6fdfec4decace6bfacbff',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9020160028347e36054f9780e546ad2',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09090c1f87b4fcc6c50a59befc7b7d1',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5762932e36ee52fdf93dc9af9a9ae5f',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga631a8e54c62472f3efd66b05c220ac99',1,'cv::cudev::operator>(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ca5edb7aebb689a224b13a06da7c096',1,'cv::cudev::operator>(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92f4356bcda49befcae07fe5897806ef',1,'cv::cudev::operator>(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga462d276943a4befba6bd1e5f7597ab43',1,'cv::cudev::operator>(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab987b25924d83dcbbb586e8c82b54457',1,'cv::cudev::operator>(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab42431af22ff2b15ff34bc2ca158d648',1,'cv::cudev::operator>(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ecf652b96c5cf329f62e04e798c7938',1,'cv::cudev::operator>(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6181bf9f0fc217c2fa0062df7dd997',1,'cv::cudev::operator>(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78139b6caee2bfff7f7e416fd4c0fa86',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33f4d71b881eec12c81fa08710e13b90',1,'cv::cudev::operator>(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa24e4c795c4f9dff281f74e4a49517',1,'cv::cudev::operator>(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga979bbc65c1aa9cb961473faeec0c001d',1,'cv::cudev::operator>(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga763bba01a3388aa4241f24b934a36b9e',1,'cv::cudev::operator>(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a322f89d75c39df09b42d571cde02c',1,'cv::cudev::operator>(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadea03e1ebb6998d08fe7e356fc675da4',1,'cv::cudev::operator>(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfd53947e82410ed70ef8af8e469be95',1,'cv::cudev::operator>(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00fc760015647c4518fc1c250b34f3a0',1,'cv::cudev::operator>(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aac1815665d44067eae7d8cb4e4be40',1,'cv::cudev::operator>(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53328b4712dbd36f5bc5fc303973997c',1,'cv::cudev::operator>(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fcd4b8ca094ed23e6c523f312c075b8',1,'cv::cudev::operator>(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e9ae77beea1adff95bca10ef7401942',1,'cv::cudev::operator>(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga208a8ecd6574e328b8b89dce3d96550a',1,'cv::cudev::operator>(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeba9c5a1af22468fa4de9e27a7291c17',1,'cv::cudev::operator>(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60ce8fe5baf2a39a1963c206fe8f2283',1,'cv::cudev::operator>(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3605088dd4d00bc3d812c01485e0c854',1,'cv::cudev::operator>(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae77b149d4b2eda29c2d2e09c7a265f1',1,'cv::cudev::operator>(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9707f1f0bd1f08a43c8c6faaf389ef',1,'cv::cudev::operator>(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa790adfb4f6f2fa460c244f2f7621ed3',1,'cv::cudev::operator>(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeed166390fcd3b6634764bad3f4dfe99',1,'cv::cudev::operator>(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd896dcb0ea5b24ddf9a17b006ed2701',1,'cv::cudev::operator>(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae003f99da4c8129f3ce6908560dd6598',1,'cv::cudev::operator>(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac94d95ec080ec57be5729ff0a14d6740',1,'cv::cudev::operator>(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3292736e722c948bfee81f8ce13d285',1,'cv::cudev::operator>(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eadb9c719cbffb8161d58910fc8bf13',1,'cv::cudev::operator>(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5aa17050b6e23908154a490b186e5592',1,'cv::cudev::operator>(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad280748a5ba0aaef06f5f48f8d162fd0',1,'cv::cudev::operator>(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga122cfa74c83428505a928ea12d304942',1,'cv::cudev::operator>(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a4586e4cf8cd4353f49b0ac4d474553',1,'cv::cudev::operator>(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39b292f62396880cbe964128a125a2a8',1,'cv::cudev::operator>(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557ed1e9462d24223497a0c53db7d90',1,'cv::cudev::operator>(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b85167fb47e745fce108d23ae3674e0',1,'cv::cudev::operator>(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef695f029df417b63799eff1f8e20218',1,'cv::cudev::operator>(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdda92bd64d36ec1d43b5ce270677166',1,'cv::cudev::operator>(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff20e4d2dbcb670af32bba301c579fbc',1,'cv::cudev::operator>(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ec6a668ce4bdaee3fb96cd6af71bd59',1,'cv::cudev::operator>(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1eba4d1da0623f9c69a57db9e769144',1,'cv::cudev::operator>(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ed513d4cb9e4110d3db70f50be835ba',1,'cv::cudev::operator>(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fbdf61b01310dfb036bb6ffef461b8a',1,'cv::cudev::operator>(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab1a02c460ac72367d4652923fba630b',1,'cv::cudev::operator>(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga293527eeddad289a3efad53f1a4b6f3f',1,'cv::cudev::operator>(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadc84b344cba3e9d8279cce4daa335a3',1,'cv::cudev::operator>(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae6976ca05a71a3867491b1d63a38d79',1,'cv::cudev::operator>(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4d496fb1ee18b3cd918b6a3092c629',1,'cv::cudev::operator>(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9683b0f490d61333a0c9b0ac6177c797',1,'cv::cudev::operator>(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf173de4fa9a66e44f6e01e46e50fb96e',1,'cv::cudev::operator>(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6961930505501ab67e70de1bec1fc7c',1,'cv::cudev::operator>(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3be2422dd410d768a47a1523612c6e2',1,'cv::cudev::operator>(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga231392fd7250c8b1cba1027db6dd2f59',1,'cv::cudev::operator>(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7365378eede3da961a558ff603f0a8f2',1,'cv::cudev::operator>(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a4ad2ef4e95c53079cda25bcb76fc53',1,'cv::cudev::operator>(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga337362bc409dec3c7470826563fd08d5',1,'cv::cudev::operator>(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a78dc7183016b7eaa8994891ac7349e',1,'cv::cudev::operator>(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb89d12f168130b16b6a852fbcf29ac1',1,'cv::cudev::operator>(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd0188a961cefcfb26b7b15fac712e82',1,'cv::cudev::operator>(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13fc85d9e1c15b1d1d2c862936ab29cf',1,'cv::cudev::operator>(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6d6be81f2d1ad7424d414f6028a6dfd',1,'cv::cudev::operator>(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c3a579dea9a2c50a6082bf7c5c50d1f',1,'cv::cudev::operator>(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c88870704b2df7f664851aed891ab38',1,'cv::cudev::operator>(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabfe335f05bb7a355f8e2cf6d4ad83c3',1,'cv::cudev::operator>(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444c5e1f7f62cf798066d5659366df23',1,'cv::cudev::operator>(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab561641feed35c20278ece35bb8797b3',1,'cv::cudev::operator>(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b861ce2de51abdd03593b3d3d84f684',1,'cv::cudev::operator>(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c1fd7fbe4e5985f1d2fa725731eb08',1,'cv::cudev::operator>(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9e6afe8941f12362335b1a80e42496',1,'cv::cudev::operator>(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9896d8eed5804f7d4900f8b8266295ba',1,'cv::cudev::operator>(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca64d102ed2cfae7f3abeb781421204',1,'cv::cudev::operator>(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac833608b2481b20d0d91a71036d45d',1,'cv::cudev::operator>(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2237c47c62d003ee6a19ff2b3cd54b2',1,'cv::cudev::operator>(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990332db3565090a646987254c79fab4',1,'cv::cudev::operator>(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4e587facdf3b1a86a40be230639efef',1,'cv::cudev::operator>(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67f6d1cb7b1b325a6dfe5414dbb94dbd',1,'cv::cudev::operator>(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98a98af64c25c869aae0f4ad0c55af4',1,'cv::cudev::operator>(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fd6dc47e174621164179fbf737f2809',1,'cv::cudev::operator>(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd34ffd2648022fee481fe264945565c',1,'cv::cudev::operator>(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c9c2d7a26f8d9c7b8834f9f190a8914',1,'cv::cudev::operator>(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga640d6afcfb462ced93eefa1b697cd060',1,'cv::cudev::operator>(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa37cb32841f9ffa14b1936e05a1ebe9',1,'cv::cudev::operator>(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e97195a2b7cecf5ede8e47d260723c',1,'cv::cudev::operator>(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga335811f06efddba5e75ce0116d04783a',1,'cv::cudev::operator>(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa4f074c9ea9489fd8b41157998c5fed',1,'cv::cudev::operator>(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f1e7ce1a6510265ead6b6207f39effc',1,'cv::cudev::operator>(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9756cee47606a4de0ca1c3c8e97a40b2',1,'cv::cudev::operator>(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d783278f798a238eb375b58e4eeade4',1,'cv::cudev::operator>(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab439a8c37814ba930d4f4f0d15095883',1,'cv::cudev::operator>(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad508ec58830cc1077eb07e8fc153fd',1,'cv::cudev::operator>(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga408471782e6c3338d5ee9de16e31644e',1,'cv::cudev::operator>(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35415f4fd50ebd8a203fef079c54ec8d',1,'cv::cudev::operator>(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14fe180ed1d9c9666c46e88a36c421a8',1,'cv::cudev::operator>(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab45d33bf92b38f1331208282fda45064',1,'cv::cudev::operator>(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c384571fec644fe63911fd26bf6e6b',1,'cv::cudev::operator>(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31473d08b4bb642729365caf9a6c0e39',1,'cv::cudev::operator>(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa100c0ecc7e8aec9341b40562ac55b3a',1,'cv::cudev::operator>(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb98ebc2ade19b8e960fa40f5d6a253e',1,'cv::cudev::operator>(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eaa0d1ca6c4bb54774350171b9e16b5',1,'cv::cudev::operator>(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6458afcdc07e562050e4315122f859d2',1,'cv::cudev::operator>(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d2cc8c1b0507e85f915853485ecc6d0',1,'cv::cudev::operator>(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9e6bd3f5911bf05d858b143d76813b13',1,'operator>(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga89a6048ae27277f5f84458078a447a7b',1,'operator>(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga53b1ef03655e02eabf49238a5927f384',1,'operator>(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf76a5cbe9661c03341fed10338283b3a',1,'operator>(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35b979bc99aa0c19b8b03d0191c0aef',1,'operator>(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fe6218c267adf7bf750b607bcee1dde',1,'operator>(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557a3a12df84d433097b5f1df0d7d04',1,'operator>(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga192ad383159b69ca2292f072b38508f9',1,'operator>(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd71f8794eb458670da81e6e31ebd40d',1,'operator>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga805cfea7bfd59489c103d6ea068e5dd8',1,'operator>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga876bfb5116ae02ad4707fb201477a535',1,'operator>(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58c9c31838a279487423f7f3582c4913',1,'operator>(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c5037a273d23375d3020863519e7732',1,'operator>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81c1cf50caa6fdfec4decace6bfacbff',1,'operator>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9020160028347e36054f9780e546ad2',1,'operator>(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09090c1f87b4fcc6c50a59befc7b7d1',1,'operator>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5762932e36ee52fdf93dc9af9a9ae5f',1,'operator>(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga631a8e54c62472f3efd66b05c220ac99',1,'operator>(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ca5edb7aebb689a224b13a06da7c096',1,'operator>(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92f4356bcda49befcae07fe5897806ef',1,'operator>(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga462d276943a4befba6bd1e5f7597ab43',1,'operator>(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab987b25924d83dcbbb586e8c82b54457',1,'operator>(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab42431af22ff2b15ff34bc2ca158d648',1,'operator>(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ecf652b96c5cf329f62e04e798c7938',1,'operator>(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6181bf9f0fc217c2fa0062df7dd997',1,'operator>(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78139b6caee2bfff7f7e416fd4c0fa86',1,'operator>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33f4d71b881eec12c81fa08710e13b90',1,'operator>(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa24e4c795c4f9dff281f74e4a49517',1,'operator>(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga979bbc65c1aa9cb961473faeec0c001d',1,'operator>(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga763bba01a3388aa4241f24b934a36b9e',1,'operator>(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a322f89d75c39df09b42d571cde02c',1,'operator>(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadea03e1ebb6998d08fe7e356fc675da4',1,'operator>(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfd53947e82410ed70ef8af8e469be95',1,'operator>(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00fc760015647c4518fc1c250b34f3a0',1,'operator>(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aac1815665d44067eae7d8cb4e4be40',1,'operator>(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53328b4712dbd36f5bc5fc303973997c',1,'operator>(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fcd4b8ca094ed23e6c523f312c075b8',1,'operator>(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e9ae77beea1adff95bca10ef7401942',1,'operator>(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga208a8ecd6574e328b8b89dce3d96550a',1,'operator>(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeba9c5a1af22468fa4de9e27a7291c17',1,'operator>(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60ce8fe5baf2a39a1963c206fe8f2283',1,'operator>(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3605088dd4d00bc3d812c01485e0c854',1,'operator>(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae77b149d4b2eda29c2d2e09c7a265f1',1,'operator>(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9707f1f0bd1f08a43c8c6faaf389ef',1,'operator>(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa790adfb4f6f2fa460c244f2f7621ed3',1,'operator>(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeed166390fcd3b6634764bad3f4dfe99',1,'operator>(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd896dcb0ea5b24ddf9a17b006ed2701',1,'operator>(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae003f99da4c8129f3ce6908560dd6598',1,'operator>(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac94d95ec080ec57be5729ff0a14d6740',1,'operator>(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3292736e722c948bfee81f8ce13d285',1,'operator>(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eadb9c719cbffb8161d58910fc8bf13',1,'operator>(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5aa17050b6e23908154a490b186e5592',1,'operator>(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad280748a5ba0aaef06f5f48f8d162fd0',1,'operator>(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga122cfa74c83428505a928ea12d304942',1,'operator>(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a4586e4cf8cd4353f49b0ac4d474553',1,'operator>(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39b292f62396880cbe964128a125a2a8',1,'operator>(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557ed1e9462d24223497a0c53db7d90',1,'operator>(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b85167fb47e745fce108d23ae3674e0',1,'operator>(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef695f029df417b63799eff1f8e20218',1,'operator>(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdda92bd64d36ec1d43b5ce270677166',1,'operator>(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff20e4d2dbcb670af32bba301c579fbc',1,'operator>(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ec6a668ce4bdaee3fb96cd6af71bd59',1,'operator>(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1eba4d1da0623f9c69a57db9e769144',1,'operator>(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ed513d4cb9e4110d3db70f50be835ba',1,'operator>(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fbdf61b01310dfb036bb6ffef461b8a',1,'operator>(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab1a02c460ac72367d4652923fba630b',1,'operator>(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga293527eeddad289a3efad53f1a4b6f3f',1,'operator>(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadc84b344cba3e9d8279cce4daa335a3',1,'operator>(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae6976ca05a71a3867491b1d63a38d79',1,'operator>(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4d496fb1ee18b3cd918b6a3092c629',1,'operator>(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9683b0f490d61333a0c9b0ac6177c797',1,'operator>(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf173de4fa9a66e44f6e01e46e50fb96e',1,'operator>(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6961930505501ab67e70de1bec1fc7c',1,'operator>(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3be2422dd410d768a47a1523612c6e2',1,'operator>(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga231392fd7250c8b1cba1027db6dd2f59',1,'operator>(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7365378eede3da961a558ff603f0a8f2',1,'operator>(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a4ad2ef4e95c53079cda25bcb76fc53',1,'operator>(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga337362bc409dec3c7470826563fd08d5',1,'operator>(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a78dc7183016b7eaa8994891ac7349e',1,'operator>(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb89d12f168130b16b6a852fbcf29ac1',1,'operator>(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd0188a961cefcfb26b7b15fac712e82',1,'operator>(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13fc85d9e1c15b1d1d2c862936ab29cf',1,'operator>(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6d6be81f2d1ad7424d414f6028a6dfd',1,'operator>(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c3a579dea9a2c50a6082bf7c5c50d1f',1,'operator>(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c88870704b2df7f664851aed891ab38',1,'operator>(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabfe335f05bb7a355f8e2cf6d4ad83c3',1,'operator>(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444c5e1f7f62cf798066d5659366df23',1,'operator>(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab561641feed35c20278ece35bb8797b3',1,'operator>(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b861ce2de51abdd03593b3d3d84f684',1,'operator>(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c1fd7fbe4e5985f1d2fa725731eb08',1,'operator>(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9e6afe8941f12362335b1a80e42496',1,'operator>(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9896d8eed5804f7d4900f8b8266295ba',1,'operator>(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca64d102ed2cfae7f3abeb781421204',1,'operator>(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac833608b2481b20d0d91a71036d45d',1,'operator>(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2237c47c62d003ee6a19ff2b3cd54b2',1,'operator>(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990332db3565090a646987254c79fab4',1,'operator>(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4e587facdf3b1a86a40be230639efef',1,'operator>(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67f6d1cb7b1b325a6dfe5414dbb94dbd',1,'operator>(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98a98af64c25c869aae0f4ad0c55af4',1,'operator>(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fd6dc47e174621164179fbf737f2809',1,'operator>(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd34ffd2648022fee481fe264945565c',1,'operator>(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c9c2d7a26f8d9c7b8834f9f190a8914',1,'operator>(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga640d6afcfb462ced93eefa1b697cd060',1,'operator>(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa37cb32841f9ffa14b1936e05a1ebe9',1,'operator>(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e97195a2b7cecf5ede8e47d260723c',1,'operator>(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga335811f06efddba5e75ce0116d04783a',1,'operator>(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa4f074c9ea9489fd8b41157998c5fed',1,'operator>(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f1e7ce1a6510265ead6b6207f39effc',1,'operator>(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9756cee47606a4de0ca1c3c8e97a40b2',1,'operator>(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d783278f798a238eb375b58e4eeade4',1,'operator>(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab439a8c37814ba930d4f4f0d15095883',1,'operator>(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad508ec58830cc1077eb07e8fc153fd',1,'operator>(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga408471782e6c3338d5ee9de16e31644e',1,'operator>(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35415f4fd50ebd8a203fef079c54ec8d',1,'operator>(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14fe180ed1d9c9666c46e88a36c421a8',1,'operator>(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab45d33bf92b38f1331208282fda45064',1,'operator>(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c384571fec644fe63911fd26bf6e6b',1,'operator>(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31473d08b4bb642729365caf9a6c0e39',1,'operator>(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa100c0ecc7e8aec9341b40562ac55b3a',1,'operator>(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb98ebc2ade19b8e960fa40f5d6a253e',1,'operator>(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eaa0d1ca6c4bb54774350171b9e16b5',1,'operator>(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6458afcdc07e562050e4315122f859d2',1,'operator>(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d2cc8c1b0507e85f915853485ecc6d0',1,'operator>(double s, const double1 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a4888830ee6fb21e7bb62e14a2ab70ba2',1,'__gnu_cxx::operator>(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a15ea80c5370562c6713c383c5277c3c0',1,'__gnu_cxx::operator>(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a3137c36cfc4f7bc7580eb06bc8d2845c',1,'__gnu_cxx::operator>(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a886fc839debeebe4e1453774a028d1e3',1,'std::operator>(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6116f2ba6a75587900983e4a6662a528',1,'std::operator>(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga00de6fe7684f71fc08bad81b4bc65c52',1,'std::operator>(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afd4ebca607a5d77bce0ce62ed7c86fb9',1,'std::operator>(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a76a6b1542f3e854da212df3a9046cd05',1,'std::operator>(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaec6e1b27604a07cb7a1158c0a1da0810',1,'std::operator>(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga61879ec22c8f941d3bc5a6f57f094779',1,'std::operator>(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a14156f76400cead9187280c59587a8f1',1,'std::operator>(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20e59f399d0143cf0517ed705d5f095a',1,'std::operator>(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5554501d29b4f818450c37cbf8e3b403',1,'std::operator>(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga99794cccf99b31cbb9c80f20ff638cc0',1,'std::operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaaee0b4d314905566d4d083f1f3cabfa4',1,'std::operator>(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a1d46b9793f5a9a6d38267007fabb0e05',1,'std::operator>(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac70654ce03713da520f19dc5a9a87edc',1,'std::operator>(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1bdb78aca267183451bbd59a262f52c9',1,'std::operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a3a727df15fd08af612b872262e50a95f',1,'std::operator>(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7788944c30c3070441dc376df8beb210',1,'std::operator>(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af745511bf2598950056525a3fd7a346b',1,'std::operator>(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a56282963f192a45f81f55fa9c6a8005a',1,'std::operator>(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0f0b7503d67a8bd548778912aa40de84',1,'std::operator>(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab05d57b2cc8854cbdb97bc0676abf2c0',1,'std::operator>(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a84b60842f88cb57f0075a964c68794b5',1,'std::__debug::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a8885d72d87c6b3b0441124b7e625b92d',1,'std::__profile::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#a05cd508a43f05f31e7fb298edd7a84e1',1,'std::rel_ops::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gabc26fba16414cb3d2c1247de4be61cfd',1,'std::tr2::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gabc26fba16414cb3d2c1247de4be61cfd',1,'operator>(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaec6e1b27604a07cb7a1158c0a1da0810',1,'operator>(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga61879ec22c8f941d3bc5a6f57f094779',1,'operator>(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20e59f399d0143cf0517ed705d5f095a',1,'operator>(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5554501d29b4f818450c37cbf8e3b403',1,'operator>(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga99794cccf99b31cbb9c80f20ff638cc0',1,'operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaaee0b4d314905566d4d083f1f3cabfa4',1,'operator>(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1bdb78aca267183451bbd59a262f52c9',1,'operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga00de6fe7684f71fc08bad81b4bc65c52',1,'operator>(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], + ['operator_3e_3d_330',['operator>=',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a39f3eecb2debd3e05e155d8769597994',1,'cv::MatExpr::operator>=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a908e8895c1daab24e5e8be7b9adddf12',1,'cv::MatExpr::operator>=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae5acab862f659f77658f59c723791d2d',1,'cv::MatExpr::operator>=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#afb86a86ce5bdb62722ad6a2c38eb2279',1,'cv::MatExpr::operator>=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac87dbdcc89fc97aff6e94ff635da8949',1,'cv::MatExpr::operator>=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a39f3eecb2debd3e05e155d8769597994',1,'cv::MatExpr::operator>=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a908e8895c1daab24e5e8be7b9adddf12',1,'cv::MatExpr::operator>=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae5acab862f659f77658f59c723791d2d',1,'cv::MatExpr::operator>=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#afb86a86ce5bdb62722ad6a2c38eb2279',1,'cv::MatExpr::operator>=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac87dbdcc89fc97aff6e94ff635da8949',1,'cv::MatExpr::operator>=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga7523b2303cf5a3e9343147742f277149',1,'cv::softdouble::operator>=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3899c1c417984a878e1623a12f364a6b',1,'cv::softfloat::operator>=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a74a943800c7f103d0990d7eef82c6453.html#a74a943800c7f103d0990d7eef82c6453',1,'nlohmann::basic_json::operator>='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab83d11de4db25633f93e067aa218cae9.html#ab83d11de4db25633f93e067aa218cae9',1,'nlohmann::basic_json::operator>='],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a94c61e0128f0794e7a34e1aecee5c445.html#a94c61e0128f0794e7a34e1aecee5c445',1,'nlohmann::basic_json::operator>='],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga192e4da1bbd83aa64b5e2e86dba8f9e9',1,'cv::operator>=()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5330cc80f66e09053ad401da24bfe0',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55b886854f93ec539b81f73de542c40d',1,'cv::cudev::operator>=(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61c7293a315c1910a0d1c6bf5963a67f',1,'cv::cudev::operator>=(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1373cae04cbfcbed044238b4c0012f52',1,'cv::cudev::operator>=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66183c3c065c37807ae7a9aac89d9683',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b53ea181ce1eb43fe1ae329325e99e8',1,'cv::cudev::operator>=(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59dbec8b57764f129596bdbcdd1e3562',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga204eca640e93cedab25090194331d1e2',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d31376fae318ac2ab9434b0d4722af',1,'cv::cudev::operator>=(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad95a5e9db7d69228b51369c9c896b56a',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89fd435cb3c2b6f23d64a7f3b4819810',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb2b192959982b295e1f878e1566591',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc12a2670b0ad46ad9469d31eebddf1b',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e8c18e6ea5465dcb4e5ac9943b2dfd5',1,'cv::cudev::operator>=(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43f457f9623ab455d55dd8f1d0327f71',1,'cv::cudev::operator>=(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5aecb08d3a88db58f50c4fb709b7933',1,'cv::cudev::operator>=(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb4d3916b4d585e3643669ec78803951',1,'cv::cudev::operator>=(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6029848613f09b4123c7938a88c53a',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0815757e177f6d5b7721244f12f6903',1,'cv::cudev::operator>=(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3fcf73436590c1ce9ad286097fe9cfc',1,'cv::cudev::operator>=(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f31eca1742f7f20d7e80cac55cbffe6',1,'cv::cudev::operator>=(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ed0450c5195379d076650cf1be91169',1,'cv::cudev::operator>=(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf4d4a962b7b8c6ca198d746416b5c3d',1,'cv::cudev::operator>=(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga477ddd386db964f74d70293d7687b0c8',1,'cv::cudev::operator>=(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7765769643c89f70c73d35ec4a3cadd',1,'cv::cudev::operator>=(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c680c140830f6d38dd143b428e2f4',1,'cv::cudev::operator>=(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf21a4fde0acb285c32c1d56008abcf41',1,'cv::cudev::operator>=(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3afa887b077a0f377b27f72350df7259',1,'cv::cudev::operator>=(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed44ab15e814fce58a672cdb92eaaaf0',1,'cv::cudev::operator>=(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8406f156d41ec17be418590d2e953a74',1,'cv::cudev::operator>=(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1f9c52c48f29114947a08f0984cc23',1,'cv::cudev::operator>=(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga539493c0b07035d7e67d87bd68856ca4',1,'cv::cudev::operator>=(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef31a3f97ef6709045c6c5e280dffef1',1,'cv::cudev::operator>=(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547d2e06b7c5d87d0392acfbbb350e3d',1,'cv::cudev::operator>=(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebe853d079262445e933d64c232dea87',1,'cv::cudev::operator>=(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b136da085c473eec683b0d25665d999',1,'cv::cudev::operator>=(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abf293a57acdb1d193efdbeb48850b7',1,'cv::cudev::operator>=(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc74e9748c7d824f4c402e7443157efd',1,'cv::cudev::operator>=(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4cfc621933360fd6c3a21434b90477a',1,'cv::cudev::operator>=(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade5ffb51464ed9a304c6ccf1eea95bff',1,'cv::cudev::operator>=(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba4b299c1f9f39e23300e9dda97f1a5',1,'cv::cudev::operator>=(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga588bf5d735442049d6513d94884fcd33',1,'cv::cudev::operator>=(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3c9bc60881121216c407af1a319ed6',1,'cv::cudev::operator>=(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6951e256e5788320f1eca5105f76596f',1,'cv::cudev::operator>=(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8694d45c659b1fee5f7806e99aac8e7',1,'cv::cudev::operator>=(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d6eedcf500e803f32a17150b27968a5',1,'cv::cudev::operator>=(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f344776a2bbd8f29184a166ef092af2',1,'cv::cudev::operator>=(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e41bcdfabc98e9ec2de85bc163826b5',1,'cv::cudev::operator>=(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f33674629adbf0b08b4fb78c25495cc',1,'cv::cudev::operator>=(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1dada72f050c77f7e18d2bf96c8e376',1,'cv::cudev::operator>=(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab363efde6df231138d5222b1b6bd48f3',1,'cv::cudev::operator>=(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb8f7ad533a2657bd11aabdcdd7ee987',1,'cv::cudev::operator>=(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a68b7438b043a42d8732d97012003f5',1,'cv::cudev::operator>=(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4154e5c15631b66c54787029ebc990c3',1,'cv::cudev::operator>=(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45a21bb3cd57a2e993037143309e84e1',1,'cv::cudev::operator>=(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dc323ca96973f3bb10ea8ff03296b78',1,'cv::cudev::operator>=(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08b0e1e9ffda58046cd9889f7068e649',1,'cv::cudev::operator>=(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4edddce6542f00b2cb1de230437ba40b',1,'cv::cudev::operator>=(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24927de1bc04bacffcbb04310862f2e',1,'cv::cudev::operator>=(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb3f698e36d064129d4414b2ad6a9a3e',1,'cv::cudev::operator>=(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ccf77a9b8d87c2980e3d2f435125264',1,'cv::cudev::operator>=(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga249d6a87d32bd5ad9f4e22f32ccd632a',1,'cv::cudev::operator>=(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b591de78c118edddff4887525e0c5d9',1,'cv::cudev::operator>=(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaac862fd70672e334a90773b88267455',1,'cv::cudev::operator>=(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga775f874d3cba778e3c0cae929b525fc8',1,'cv::cudev::operator>=(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4590cd1de2f1f07aa520e168ea968c27',1,'cv::cudev::operator>=(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e5b8010cca18aab7e53847d1133ce81',1,'cv::cudev::operator>=(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85ba6a29fe83842bfffc726e582b5ee3',1,'cv::cudev::operator>=(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e36f2665d9739cc06ae0cb2562e8c0',1,'cv::cudev::operator>=(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e320de3bce9ed33ff9c8fc57be6d39',1,'cv::cudev::operator>=(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad59ee5976df102e72b1ff749231c9f47',1,'cv::cudev::operator>=(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67126297a64ef25f2c3194020fca3cad',1,'cv::cudev::operator>=(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a68b5ab03282686225ed7b88012c4b',1,'cv::cudev::operator>=(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae68aad51dc7f176ef197ee8c43c3a41d',1,'cv::cudev::operator>=(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga474292d4a9c6579fc2d31c9dcdcaa971',1,'cv::cudev::operator>=(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee757427c34f7ec54713ef3daae854ef',1,'cv::cudev::operator>=(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73786eb58807a17a538c755e34d9675d',1,'cv::cudev::operator>=(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab24f6ed6cb8e1e447b97a75be6654f7f',1,'cv::cudev::operator>=(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae61d709025c856d3146d10cb7e788d75',1,'cv::cudev::operator>=(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga802b60c4cd50658153f7e88b252935c5',1,'cv::cudev::operator>=(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab681691fbf17f68b4e9d588645b08116',1,'cv::cudev::operator>=(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d8502df0ee39c8dbae6ae47d4806b8a',1,'cv::cudev::operator>=(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8ffbcfb9495f8eea8cde1af08039d6',1,'cv::cudev::operator>=(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcbec3693958703c755c64ce0937ba3',1,'cv::cudev::operator>=(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7768c8e69a236df27818762a8f104c35',1,'cv::cudev::operator>=(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6879e2b18878ecceaab7af951c8d02fc',1,'cv::cudev::operator>=(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacacfa7f605da556808ffabf98be76b0',1,'cv::cudev::operator>=(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa4b9df279731155760f059dbe663be7',1,'cv::cudev::operator>=(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga932feafc496906a1677f88fc87ea080b',1,'cv::cudev::operator>=(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0b5d7bde9d408e0589cd5f21072be91',1,'cv::cudev::operator>=(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053ac7b33a7fdc5d34218983001f0f43',1,'cv::cudev::operator>=(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c72029e1748eb9921b128c7e1306487',1,'cv::cudev::operator>=(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga646651e94a7b468f128be9c30a448e94',1,'cv::cudev::operator>=(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f6ccf218473b80b7b2dcc253febdc9a',1,'cv::cudev::operator>=(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9507310e4ad6cfcbca66c2fd7c7082f',1,'cv::cudev::operator>=(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b1151c7a2a2ddd85dcf62518c58d49',1,'cv::cudev::operator>=(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0edff402253aa4596b3dc6854b6af18e',1,'cv::cudev::operator>=(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1531b3d6906a273b4cf9e8c56e19caa',1,'cv::cudev::operator>=(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fbf32a1fa03bb675190ebd2adb3ac70',1,'cv::cudev::operator>=(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34384f5470f48a898cd982db515575c3',1,'cv::cudev::operator>=(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2b88160c219e0921cfea0acf8c246c5',1,'cv::cudev::operator>=(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga478501caf9d016ecb74e586aa74a8eff',1,'cv::cudev::operator>=(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga343064aec5bc2570785ee2e4b25f2190',1,'cv::cudev::operator>=(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2eab9bc4ae70aa428b0a54595b4d1b2',1,'cv::cudev::operator>=(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad08e83716e56a26fe1d0e187f0d119c0',1,'cv::cudev::operator>=(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4010de5c35fd52658f696ef5106f8d8b',1,'cv::cudev::operator>=(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6abb0e15698a012d2de983ded0ab3030',1,'cv::cudev::operator>=(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d8af3d392d78262551dea823f822220',1,'cv::cudev::operator>=(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2ed51d9bd9237ec4ee957a2861de80d7',1,'cv::cudev::operator>=(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae5341fc17764c044f28d7510fd879d',1,'cv::cudev::operator>=(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510b88a926bd78ed6550626a57f297f5',1,'cv::cudev::operator>=(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a824a0f0b67806b6db61f3532ec2c97',1,'cv::cudev::operator>=(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95c4a13893450c74268cecbb7a4d47a7',1,'cv::cudev::operator>=(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ddf2b8e66168e64e5baec6ce0e558e',1,'cv::cudev::operator>=(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e68f9ecf09b25e36f1530afba43747d',1,'cv::cudev::operator>=(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4827daed85d7647479290921fae85f9',1,'cv::cudev::operator>=(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga731e1a86a51c771a75d83daa958df9e0',1,'cv::cudev::operator>=(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1f457d5eb24579073db8c8c0dd3d1ad',1,'cv::cudev::operator>=(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8e092faec9f57baa41674711a444ea',1,'cv::cudev::operator>=(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga541f5919f746411f043d670afb3ba7b3',1,'cv::cudev::operator>=(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3899c1c417984a878e1623a12f364a6b',1,'operator>=(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga7523b2303cf5a3e9343147742f277149',1,'operator>=(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga192e4da1bbd83aa64b5e2e86dba8f9e9',1,'operator>=(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5330cc80f66e09053ad401da24bfe0',1,'operator>=(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55b886854f93ec539b81f73de542c40d',1,'operator>=(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61c7293a315c1910a0d1c6bf5963a67f',1,'operator>=(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1373cae04cbfcbed044238b4c0012f52',1,'operator>=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66183c3c065c37807ae7a9aac89d9683',1,'operator>=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b53ea181ce1eb43fe1ae329325e99e8',1,'operator>=(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59dbec8b57764f129596bdbcdd1e3562',1,'operator>=(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga204eca640e93cedab25090194331d1e2',1,'operator>=(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d31376fae318ac2ab9434b0d4722af',1,'operator>=(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad95a5e9db7d69228b51369c9c896b56a',1,'operator>=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89fd435cb3c2b6f23d64a7f3b4819810',1,'operator>=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb2b192959982b295e1f878e1566591',1,'operator>=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc12a2670b0ad46ad9469d31eebddf1b',1,'operator>=(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e8c18e6ea5465dcb4e5ac9943b2dfd5',1,'operator>=(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43f457f9623ab455d55dd8f1d0327f71',1,'operator>=(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5aecb08d3a88db58f50c4fb709b7933',1,'operator>=(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb4d3916b4d585e3643669ec78803951',1,'operator>=(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6029848613f09b4123c7938a88c53a',1,'operator>=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0815757e177f6d5b7721244f12f6903',1,'operator>=(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3fcf73436590c1ce9ad286097fe9cfc',1,'operator>=(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f31eca1742f7f20d7e80cac55cbffe6',1,'operator>=(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ed0450c5195379d076650cf1be91169',1,'operator>=(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf4d4a962b7b8c6ca198d746416b5c3d',1,'operator>=(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga477ddd386db964f74d70293d7687b0c8',1,'operator>=(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7765769643c89f70c73d35ec4a3cadd',1,'operator>=(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c680c140830f6d38dd143b428e2f4',1,'operator>=(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf21a4fde0acb285c32c1d56008abcf41',1,'operator>=(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3afa887b077a0f377b27f72350df7259',1,'operator>=(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed44ab15e814fce58a672cdb92eaaaf0',1,'operator>=(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8406f156d41ec17be418590d2e953a74',1,'operator>=(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1f9c52c48f29114947a08f0984cc23',1,'operator>=(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga539493c0b07035d7e67d87bd68856ca4',1,'operator>=(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef31a3f97ef6709045c6c5e280dffef1',1,'operator>=(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547d2e06b7c5d87d0392acfbbb350e3d',1,'operator>=(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebe853d079262445e933d64c232dea87',1,'operator>=(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b136da085c473eec683b0d25665d999',1,'operator>=(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abf293a57acdb1d193efdbeb48850b7',1,'operator>=(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc74e9748c7d824f4c402e7443157efd',1,'operator>=(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4cfc621933360fd6c3a21434b90477a',1,'operator>=(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade5ffb51464ed9a304c6ccf1eea95bff',1,'operator>=(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba4b299c1f9f39e23300e9dda97f1a5',1,'operator>=(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga588bf5d735442049d6513d94884fcd33',1,'operator>=(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3c9bc60881121216c407af1a319ed6',1,'operator>=(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6951e256e5788320f1eca5105f76596f',1,'operator>=(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8694d45c659b1fee5f7806e99aac8e7',1,'operator>=(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d6eedcf500e803f32a17150b27968a5',1,'operator>=(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f344776a2bbd8f29184a166ef092af2',1,'operator>=(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e41bcdfabc98e9ec2de85bc163826b5',1,'operator>=(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f33674629adbf0b08b4fb78c25495cc',1,'operator>=(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1dada72f050c77f7e18d2bf96c8e376',1,'operator>=(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab363efde6df231138d5222b1b6bd48f3',1,'operator>=(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb8f7ad533a2657bd11aabdcdd7ee987',1,'operator>=(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a68b7438b043a42d8732d97012003f5',1,'operator>=(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4154e5c15631b66c54787029ebc990c3',1,'operator>=(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45a21bb3cd57a2e993037143309e84e1',1,'operator>=(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dc323ca96973f3bb10ea8ff03296b78',1,'operator>=(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08b0e1e9ffda58046cd9889f7068e649',1,'operator>=(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4edddce6542f00b2cb1de230437ba40b',1,'operator>=(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24927de1bc04bacffcbb04310862f2e',1,'operator>=(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb3f698e36d064129d4414b2ad6a9a3e',1,'operator>=(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ccf77a9b8d87c2980e3d2f435125264',1,'operator>=(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga249d6a87d32bd5ad9f4e22f32ccd632a',1,'operator>=(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b591de78c118edddff4887525e0c5d9',1,'operator>=(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaac862fd70672e334a90773b88267455',1,'operator>=(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga775f874d3cba778e3c0cae929b525fc8',1,'operator>=(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4590cd1de2f1f07aa520e168ea968c27',1,'operator>=(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e5b8010cca18aab7e53847d1133ce81',1,'operator>=(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85ba6a29fe83842bfffc726e582b5ee3',1,'operator>=(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e36f2665d9739cc06ae0cb2562e8c0',1,'operator>=(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e320de3bce9ed33ff9c8fc57be6d39',1,'operator>=(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad59ee5976df102e72b1ff749231c9f47',1,'operator>=(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67126297a64ef25f2c3194020fca3cad',1,'operator>=(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a68b5ab03282686225ed7b88012c4b',1,'operator>=(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae68aad51dc7f176ef197ee8c43c3a41d',1,'operator>=(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga474292d4a9c6579fc2d31c9dcdcaa971',1,'operator>=(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee757427c34f7ec54713ef3daae854ef',1,'operator>=(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73786eb58807a17a538c755e34d9675d',1,'operator>=(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab24f6ed6cb8e1e447b97a75be6654f7f',1,'operator>=(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae61d709025c856d3146d10cb7e788d75',1,'operator>=(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga802b60c4cd50658153f7e88b252935c5',1,'operator>=(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab681691fbf17f68b4e9d588645b08116',1,'operator>=(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d8502df0ee39c8dbae6ae47d4806b8a',1,'operator>=(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8ffbcfb9495f8eea8cde1af08039d6',1,'operator>=(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcbec3693958703c755c64ce0937ba3',1,'operator>=(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7768c8e69a236df27818762a8f104c35',1,'operator>=(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6879e2b18878ecceaab7af951c8d02fc',1,'operator>=(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacacfa7f605da556808ffabf98be76b0',1,'operator>=(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa4b9df279731155760f059dbe663be7',1,'operator>=(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga932feafc496906a1677f88fc87ea080b',1,'operator>=(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0b5d7bde9d408e0589cd5f21072be91',1,'operator>=(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053ac7b33a7fdc5d34218983001f0f43',1,'operator>=(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c72029e1748eb9921b128c7e1306487',1,'operator>=(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga646651e94a7b468f128be9c30a448e94',1,'operator>=(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f6ccf218473b80b7b2dcc253febdc9a',1,'operator>=(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9507310e4ad6cfcbca66c2fd7c7082f',1,'operator>=(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b1151c7a2a2ddd85dcf62518c58d49',1,'operator>=(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0edff402253aa4596b3dc6854b6af18e',1,'operator>=(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1531b3d6906a273b4cf9e8c56e19caa',1,'operator>=(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fbf32a1fa03bb675190ebd2adb3ac70',1,'operator>=(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34384f5470f48a898cd982db515575c3',1,'operator>=(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2b88160c219e0921cfea0acf8c246c5',1,'operator>=(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga478501caf9d016ecb74e586aa74a8eff',1,'operator>=(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga343064aec5bc2570785ee2e4b25f2190',1,'operator>=(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2eab9bc4ae70aa428b0a54595b4d1b2',1,'operator>=(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad08e83716e56a26fe1d0e187f0d119c0',1,'operator>=(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4010de5c35fd52658f696ef5106f8d8b',1,'operator>=(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6abb0e15698a012d2de983ded0ab3030',1,'operator>=(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d8af3d392d78262551dea823f822220',1,'operator>=(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2ed51d9bd9237ec4ee957a2861de80d7',1,'operator>=(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae5341fc17764c044f28d7510fd879d',1,'operator>=(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510b88a926bd78ed6550626a57f297f5',1,'operator>=(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a824a0f0b67806b6db61f3532ec2c97',1,'operator>=(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95c4a13893450c74268cecbb7a4d47a7',1,'operator>=(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ddf2b8e66168e64e5baec6ce0e558e',1,'operator>=(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e68f9ecf09b25e36f1530afba43747d',1,'operator>=(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4827daed85d7647479290921fae85f9',1,'operator>=(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga731e1a86a51c771a75d83daa958df9e0',1,'operator>=(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1f457d5eb24579073db8c8c0dd3d1ad',1,'operator>=(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8e092faec9f57baa41674711a444ea',1,'operator>=(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga541f5919f746411f043d670afb3ba7b3',1,'operator>=(double s, const double1 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a1ec2deb39f1b5127f5a8bb2b26450c03',1,'__gnu_cxx::operator>=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a9fd2a7c53cf7d775379e0d6097658545',1,'__gnu_cxx::operator>=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#aa626858a9a44d7932ad8c38fb4905b34',1,'__gnu_cxx::operator>=(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a11bb9b3800196c309babae27f4b4a900',1,'std::operator>=(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac65d320a052a5d4d1477ef25b5627be5',1,'std::operator>=(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga4abfa75dbeb7ee6922ab97aaaba57d47',1,'std::operator>=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acddc46a5f1205d53f5f682a89259c38e',1,'std::operator>=(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abf5b635cc4dfc9f737e9a3933b6d7e06',1,'std::operator>=(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga9ee66c57996b60af8514834ba5054af4',1,'std::operator>=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga81455a2af5c1721d3340fa06eaccfe06',1,'std::operator>=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a69dd44d827cf392b3490c7498d47cd5b',1,'std::operator>=(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa4a816fd640e88c0b2e9b0bb6cc4cb19',1,'std::operator>=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga86523db2bbd873f4bc26c42a77f443b3',1,'std::operator>=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1225fba40c8af2c834e8201af601829b',1,'std::operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga71a6363d6cad986521d5f5a1537a1e06',1,'std::operator>=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8bd7da47a9941d7e825411420feb6ac1',1,'std::operator>=(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a03f03b3697da916e95a09b1488df52df',1,'std::operator>=(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fdb938850a723e8e447fce21fc0b7c2',1,'std::operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9a32938be630f180eddc69f0402d13ca',1,'std::operator>=(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a628eda81f6cb2988d8f5908f631cdb46',1,'std::operator>=(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5e3f58e54e9cbbcda75328fada9fa1a5',1,'std::operator>=(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4fd05c4c42075e6787d13b7dd454ba77',1,'std::operator>=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a56fe512b61535754991c71651054a4a3',1,'std::operator>=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad9ef507927a631a73f69c9d4d8add693',1,'std::operator>=(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a636d8ef229361158ab4945c00d7676be',1,'std::__debug::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a73aff27c428faa615874629ae0250e64',1,'std::__profile::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#ac93a7559412662f6dfd7c206ecb98f99',1,'std::rel_ops::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga08b65275697884e0facdf36f73c0bb7d',1,'std::tr2::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga08b65275697884e0facdf36f73c0bb7d',1,'operator>=(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga9ee66c57996b60af8514834ba5054af4',1,'operator>=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga81455a2af5c1721d3340fa06eaccfe06',1,'operator>=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa4a816fd640e88c0b2e9b0bb6cc4cb19',1,'operator>=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga86523db2bbd873f4bc26c42a77f443b3',1,'operator>=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1225fba40c8af2c834e8201af601829b',1,'operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga71a6363d6cad986521d5f5a1537a1e06',1,'operator>=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fdb938850a723e8e447fce21fc0b7c2',1,'operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga4abfa75dbeb7ee6922ab97aaaba57d47',1,'operator>=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], + ['operator_3e_3e_331',['operator>>',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aeff689aa3f1d9e49c24e22b097d17b04',1,'cv::FileNode::operator>>(const FileNode &n, _Tp &value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a4e6bc57b90b1336bc5fdaa055c5295cc',1,'cv::FileNode::operator>>(const FileNode &n, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a002a7403a3c77de6fdb3e080cf4657db',1,'cv::FileNode::operator>>(const FileNode &n, KeyPoint &kpt)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9137a05efd7738001795800234e73eef',1,'cv::FileNode::operator>>(const FileNode &n, DMatch &m)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aeff689aa3f1d9e49c24e22b097d17b04',1,'cv::FileNode::operator>>(const FileNode &n, _Tp &value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a4e6bc57b90b1336bc5fdaa055c5295cc',1,'cv::FileNode::operator>>(const FileNode &n, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a002a7403a3c77de6fdb3e080cf4657db',1,'cv::FileNode::operator>>(const FileNode &n, KeyPoint &kpt)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9137a05efd7738001795800234e73eef',1,'cv::FileNode::operator>>(const FileNode &n, DMatch &m)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a0e9987928ef46a3fe99b3fe02b659dd4',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, _Tp &value)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a1b91e417a7103145b4997e086aec99df',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a0e9987928ef46a3fe99b3fe02b659dd4',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, _Tp &value)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a1b91e417a7103145b4997e086aec99df',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a199844fb74226a28b3ce3a39d1ff6765',1,'cv::VideoCapture::operator>>(Mat &image)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a35eb427f16b4ea5c502922aba9da835c',1,'cv::VideoCapture::operator>>(UMat &image)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'basic_iostream< char >::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'basic_iostream< char >::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_iostream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_iostream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_iostream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_iostream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_iostream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_iostream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_iostream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_iostream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_iostream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_iostream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_iostream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_iostream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_iostream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_iostream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_iostream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_iostream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_iostream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_iostream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_iostream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_iostream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_iostream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_iostream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_iostream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_iostream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_iostream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_iostream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_iostream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_iostream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_iostream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_iostream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'basic_istream< char >::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'basic_istream< char >::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'basic_istream< char, _Traits >::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'basic_istream< char, _Traits >::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char, _Traits >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char, _Traits >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char, _Traits >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char, _Traits >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char, _Traits >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char, _Traits >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char, _Traits >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char, _Traits >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char, _Traits >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char, _Traits >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char, _Traits >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char, _Traits >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char, _Traits >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char, _Traits >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char, _Traits >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char, _Traits >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char, _Traits >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char, _Traits >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char, _Traits >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char, _Traits >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char, _Traits >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char, _Traits >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char, _Traits >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char, _Traits >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char, _Traits >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char, _Traits >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char, _Traits >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char, _Traits >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char, _Traits >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char, _Traits >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#abe79b6964f9b74c546de48e9c34c7388',1,'gamma_distribution< double >::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#abe79b6964f9b74c546de48e9c34c7388',1,'gamma_distribution< result_type >::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a4fe6e606a61991ce6007b14402043497',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ac440bfeab944ac2efe370a05088ed47c',1,'normal_distribution< double >::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ac440bfeab944ac2efe370a05088ed47c',1,'normal_distribution< result_type >::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_fstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_fstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_fstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_fstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_fstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_fstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_fstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_fstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_fstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_fstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_fstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_fstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_fstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_fstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_fstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_fstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_fstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_fstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_fstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_fstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_fstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_fstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_fstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_fstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_fstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_fstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_fstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_fstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_fstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_fstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_fstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_fstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_ifstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_ifstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_ifstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_ifstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_ifstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_ifstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_ifstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_ifstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_ifstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_ifstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_ifstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_ifstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_ifstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_ifstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_ifstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_ifstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_ifstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_ifstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_ifstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_ifstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_ifstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_ifstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_ifstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_ifstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_ifstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_ifstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_ifstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_ifstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_ifstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_ifstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_ifstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_ifstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_iostream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_iostream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_iostream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_iostream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_iostream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_iostream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_iostream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_iostream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_iostream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_iostream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_iostream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_iostream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_iostream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_iostream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_iostream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_iostream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_iostream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_iostream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_iostream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_iostream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_iostream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_iostream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_iostream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_iostream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_iostream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_iostream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_iostream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_iostream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_iostream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_iostream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_iostream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_iostream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_istream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_istream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_istringstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_istringstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_stringstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_stringstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_stringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_stringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_stringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_stringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_stringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_stringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_stringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_stringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_stringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_stringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_stringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_stringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_stringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_stringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_stringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_stringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_stringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_stringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_stringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_stringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_stringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_stringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_stringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_stringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_stringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_stringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_stringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_stringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_stringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_stringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a6770ba69c9a9d9b6d45fb2d262b6739d',1,'std::binomial_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aeba729a09e2f6c19b000476fa7eb0fcd',1,'std::bitset::operator>>(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aeba729a09e2f6c19b000476fa7eb0fcd',1,'std::bitset::operator>>(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a5c7725e75b4c3fec1a13c3258ceaa6bc',1,'std::chi_squared_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a47191ff90d26d583cadb261b7de61c1d',1,'std::discard_block_engine::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#aab065c34d9b99c0ffaaed26759eb193c',1,'std::discrete_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#abab2538be3fead2df80ac93a9ebaa7f3',1,'std::fisher_f_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#abe79b6964f9b74c546de48e9c34c7388',1,'std::gamma_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a13e9be7110a9e32004584ac71de9190f',1,'std::independent_bits_engine::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a337332c3de4a035002d715e35f79c49f',1,'std::linear_congruential_engine::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#a21983da6e9b4301e89130f48917e139b',1,'std::lognormal_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a4fe6e606a61991ce6007b14402043497',1,'std::mersenne_twister_engine::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#a93bd5f1af62bc168064fa22619bc1604',1,'std::negative_binomial_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ac440bfeab944ac2efe370a05088ed47c',1,'std::normal_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#aa000eee610a97f1fc2c8a45e44d67c71',1,'std::piecewise_constant_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#af90a22b42c0c9a7458f57e07738e2a18',1,'std::piecewise_linear_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#ada1ead00f77a845a7dad6a50e38abe2e',1,'std::poisson_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#ab19d98410e08562d78ed353f60ad4fc7',1,'std::shuffle_order_engine::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a23626484794f6d9d4377d3fa16989f91',1,'std::student_t_distribution::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a0420033b44c3e22e2157546faa851f00',1,'std::subtract_with_carry_engine::operator>>'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae9a03a35d703cdbbf1155330a59eed57',1,'std::tr2::dynamic_bitset::operator>>(size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae9a03a35d703cdbbf1155330a59eed57',1,'std::tr2::dynamic_bitset::operator>>(size_type __pos) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a34d6a60dd99e9f33b8273a1c8db5669b.html#a34d6a60dd99e9f33b8273a1c8db5669b',1,'nlohmann::basic_json::operator>>'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aaf363408931d76472ded14017e59c9e8.html#aaf363408931d76472ded14017e59c9e8',1,'nlohmann::basic_json::operator>>'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaae9733cc2b353835e1a8723dcfc171e2',1,'cv::operator>>()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a685b4cdb4af2a8d7a68fbfcd8e2548',1,'cv::cudev::operator>>(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga837d4419807a80ee32b3c961913cb7e4',1,'cv::cudev::operator>>(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefe26fd801b0820623044113109b13ec',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490716b718d4dd43c89d51694861843b',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5290b7ec0ee646136f388beb08e115f8',1,'cv::cudev::operator>>(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2d998b1143eae5f5d4f6cfebdfb00df',1,'cv::cudev::operator>>(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9af265df70ba6c6606a9384e989ae155',1,'cv::cudev::operator>>(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23a3e1f1df0cc826fa1e31152ef3c721',1,'cv::cudev::operator>>(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f3301b8bc25bdd2cb00ee98a81030b4',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c5c20ba9fe5527ded3ff0fd72f53cbf',1,'cv::cudev::operator>>(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05f308ef809ecd39ef9985554956d16a',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad327490c86961a8f0a65abc413fa546f',1,'cv::cudev::operator>>(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b60617070fde498fd3217af505e0c1',1,'cv::cudev::operator>>(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147aab19cdedc271193e916d905e7caf',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056be68e684c65e2836b5ef1b8089d3f',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac382672463e961bd8ab509e436b94494',1,'cv::cudev::operator>>(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa742399be625c93c587e8c358d0885cc',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga659b874a5439f4483fc9c1a7f6ea5d1f',1,'cv::cudev::operator>>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa23bb682b46b78eef7c4c6febadd786c',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3fe97f46e29307fc51714496a0de0e3',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70f05e9528501005e278d9767f670818',1,'cv::cudev::operator>>(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e10e34970a384ffc99c5a56d78098bb',1,'cv::cudev::operator>>(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga036cb20b4c06864975ca4df3a6a7e1c3',1,'cv::cudev::operator>>(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dfe8d94a8059fea9c67a71fe1654cbf',1,'cv::cudev::operator>>(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaae9733cc2b353835e1a8723dcfc171e2',1,'operator>>(const v_reg< _Tp, n > &a, int imm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a685b4cdb4af2a8d7a68fbfcd8e2548',1,'operator>>(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga837d4419807a80ee32b3c961913cb7e4',1,'operator>>(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefe26fd801b0820623044113109b13ec',1,'operator>>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490716b718d4dd43c89d51694861843b',1,'operator>>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5290b7ec0ee646136f388beb08e115f8',1,'operator>>(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2d998b1143eae5f5d4f6cfebdfb00df',1,'operator>>(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9af265df70ba6c6606a9384e989ae155',1,'operator>>(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23a3e1f1df0cc826fa1e31152ef3c721',1,'operator>>(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f3301b8bc25bdd2cb00ee98a81030b4',1,'operator>>(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c5c20ba9fe5527ded3ff0fd72f53cbf',1,'operator>>(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05f308ef809ecd39ef9985554956d16a',1,'operator>>(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad327490c86961a8f0a65abc413fa546f',1,'operator>>(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b60617070fde498fd3217af505e0c1',1,'operator>>(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147aab19cdedc271193e916d905e7caf',1,'operator>>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056be68e684c65e2836b5ef1b8089d3f',1,'operator>>(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac382672463e961bd8ab509e436b94494',1,'operator>>(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa742399be625c93c587e8c358d0885cc',1,'operator>>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga659b874a5439f4483fc9c1a7f6ea5d1f',1,'operator>>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa23bb682b46b78eef7c4c6febadd786c',1,'operator>>(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3fe97f46e29307fc51714496a0de0e3',1,'operator>>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70f05e9528501005e278d9767f670818',1,'operator>>(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e10e34970a384ffc99c5a56d78098bb',1,'operator>>(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga036cb20b4c06864975ca4df3a6a7e1c3',1,'operator>>(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dfe8d94a8059fea9c67a71fe1654cbf',1,'operator>>(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf81c75e50c9ee8a791d90329d2fc7ef8',1,'std::operator>>(basic_istream< _CharT, _Traits > &__is, complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acda683e8b3ae5f1dd425bb99774304a7',1,'std::operator>>(_Istream &&__is, _Tp &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gab49649ed7cc5cb819ce52620f227b1a7',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_int_distribution< _IntType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gafb5c87acd910ec70edaedef33cf32aee',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_real_distribution< _RealType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a113f151882a47755a4b297813977bbdc',1,'std::operator>>(basic_istream< _CharT, _Traits > &__is, __gnu_cxx::__versa_string< _CharT, _Traits, _Alloc, _Base > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga63a43b47a5315c8b1b55002af2eb1669',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::cauchy_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga2a24c2f5da07f3a713e036875355ad57',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::bernoulli_distribution &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga30ec0007b5169ab3c6847033db603493',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::geometric_distribution< _IntType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5dbbb1871bc0160e0b9cf609e222fb18',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::exponential_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gae0fa60823d48bfd5b1d7a7c0063826ba',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::weibull_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga391e8f9fb533a5fb81f4099e9b03ff6a',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::extreme_value_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6447193cb914c78fb13064c210e26ed8',1,'std::operator>>(basic_istream< _CharT, _Traits > &__is, basic_string< _CharT, _Traits, _Alloc > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a01cd5810d682dec840eee4ed6d2170d4',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, bitset< _Nb > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8f6ffa961cd02381c76b3d3345641f4d',1,'std::operator>>(basic_istream< _CharT, _Traits > &__in, _CharT &__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad29bf992665f01e4a3623420b87f40d3',1,'std::operator>>(basic_istream< char, _Traits > &__in, unsigned char &__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a257b6c1fab9276d9a9ca63c29279d48c',1,'std::operator>>(basic_istream< char, _Traits > &__in, signed char &__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afd645e31e415b300d870dba3de0af813',1,'std::operator>>(basic_istream< _CharT, _Traits > &__in, _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a40a0021a5cf39a79c2ff66d3c31ae277',1,'std::operator>>(basic_istream< char > &__in, char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aefcf45965f6bebc6083ba4d0207cca1d',1,'std::operator>>(basic_istream< char, _Traits > &__in, unsigned char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abcee0d0bbe61b8a00e0336411d295f79',1,'std::operator>>(basic_istream< char, _Traits > &__in, signed char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html#a9dc7b861adff63cefa05b539068f727e',1,'std::__detail::operator>>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga4618b05732d8eec5161f28b23c23227d',1,'std::tr2::operator>>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga2a24c2f5da07f3a713e036875355ad57',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::bernoulli_distribution &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga30ec0007b5169ab3c6847033db603493',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::geometric_distribution< _IntType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf81c75e50c9ee8a791d90329d2fc7ef8',1,'operator>>(basic_istream< _CharT, _Traits > &__is, complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga4618b05732d8eec5161f28b23c23227d',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, dynamic_bitset< _WordT, _Alloc > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga63a43b47a5315c8b1b55002af2eb1669',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::cauchy_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5dbbb1871bc0160e0b9cf609e222fb18',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::exponential_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gae0fa60823d48bfd5b1d7a7c0063826ba',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::weibull_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga391e8f9fb533a5fb81f4099e9b03ff6a',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::extreme_value_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gab49649ed7cc5cb819ce52620f227b1a7',1,'operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_int_distribution< _IntType > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gafb5c87acd910ec70edaedef33cf32aee',1,'operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_real_distribution< _RealType > &)(Global Namespace)']]], + ['operator_3e_3e_3d_332',['operator>>=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac07ef85ee38aa3428883eb50f719cbca',1,'std::bitset::operator>>=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac07ef85ee38aa3428883eb50f719cbca',1,'std::bitset::operator>>=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8293a4feaf1bde96e155e6ba528d0b9a',1,'std::gslice_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga611bd59fab7a43ce79f1707eea03be7a',1,'std::indirect_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga87f02d439b80dd0d351ae9f827c4f77e',1,'std::mask_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7ebc66086e23f1d4bb5cc554fedde16b',1,'std::slice_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab0acb45e7697ddaa619582139a55227e',1,'std::tr2::dynamic_bitset::operator>>=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab0acb45e7697ddaa619582139a55227e',1,'std::tr2::dynamic_bitset::operator>>=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5ce6f32c286043434e864d28271f2069',1,'std::valarray::operator>>=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7f2a41abd2f316f4de7942652da2410d',1,'std::valarray::operator>>=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5ce6f32c286043434e864d28271f2069',1,'valarray< size_t >::operator>>=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7f2a41abd2f316f4de7942652da2410d',1,'valarray< size_t >::operator>>=(const valarray< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8293a4feaf1bde96e155e6ba528d0b9a',1,'operator>>=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5ce6f32c286043434e864d28271f2069',1,'operator>>=(const _Tp &)(Global Namespace)']]], + ['operator_5b_5d_333',['operator[]',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a544bdab727d3b76828c915b0fe30a8e6',1,'cv::FileNode::operator[](const String &nodename) const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a611004b953e5a13140f2d344ed4f6398',1,'cv::FileNode::operator[](const char *nodename) const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a031b7f492abe0f414a7627272bd6e467',1,'cv::FileNode::operator[](int i) const'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#adc7eff268ab95c664657a03e72ed85a5',1,'cv::FileStorage::operator[](const String &nodename) const'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a532f6a27dd57d0f640c6a5a9acddac88',1,'cv::FileStorage::operator[](const char *nodename) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ac04a07edf33eaef0dce8a2c7d5d193b2',1,'cv::cudev::GpuMat_::operator[](int y)'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a1caf23a850242f18af5cab4478b127b5',1,'cv::cudev::GpuMat_::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'cv::Mat_::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'cv::Mat_::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< double >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< double >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< float >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< float >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< uchar >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< uchar >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< unsigned char >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< unsigned char >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#aaf943dc53b7d402993ccc1f44412b594',1,'cv::MatConstIterator::operator[]()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ad9682e4ade6a6f2b83d85b30d94b978f',1,'cv::MatConstIterator_::operator[]()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ab96bf874711db314307ac6a711666e85',1,'cv::MatIterator_::operator[]()'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#aa43c8afeb7e798ea5f1d585d1d3eab93',1,'cv::MatSize::operator[](int i) const'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a8a0c5d3f786fae008a10a6e3bc962215',1,'cv::MatSize::operator[](int i)'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#ae1261117212294e7dbd88c57dc4eb655',1,'cv::MatStep::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a8a4d7e49dff4d9c705e4840a5af56f70',1,'cv::MatStep::operator[](int i)'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#afc4d1e3df056b5fed3c76f0a03a212d4',1,'cv::gapi::own::Scalar::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#aa3d769161bbbcb027050c7e17ff1cade',1,'cv::gapi::own::Scalar::operator[](int i)'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a24367c518aca63c85976897fedd3153a',1,'cv::tbm::Track::operator[](size_t i) const'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#aa202964fa465e9edc7833c848866530c',1,'cv::tbm::Track::operator[](size_t i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'cv::Vec::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'cv::Vec::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< _Tp, 4 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< _Tp, 4 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, 2 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, 2 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, 3 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, 3 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, 4 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, 4 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, nFeatures >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, nFeatures >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< float, 2 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< float, 2 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< float, 3 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< float, 3 >::operator[](int i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab2b57e74d31d0fc2340d2cece8700b4a',1,'__gnu_cxx::__versa_string::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9b58791d4ef7809989f8eaf599f980f1',1,'__gnu_cxx::__versa_string::operator[](size_type __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< _CharT >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< _CharT >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< _CharT, _Traits, _Allocator >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< _CharT, _Traits, _Allocator >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< char >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< char >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< char_type, _Traits, _Alloc >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< char_type, _Traits, _Alloc >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< value_type >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< value_type >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a461a433ad999e2d22e10f45addf1bb67',1,'deque< _StateSeqT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a513a4ab26ac9df40d7ec95fc50e1218b',1,'deque< _StateSeqT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6021c27572ef3bc03cea38c66dde3783',1,'match_results< _Bi_iter >::operator[](size_type __sub) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'match_results< _Bi_iter >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'match_results< _Bi_iter >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6021c27572ef3bc03cea38c66dde3783',1,'match_results< _Bi_iter >::operator[](size_type __sub) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'std::basic_string::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'std::basic_string::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a03ad7ade15b93f22b17648d53ba20062',1,'std::bitset::operator[](size_t __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#afa6b9908b9752384b42da517a3ae3d8c',1,'std::bitset::operator[](size_t __position) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a03ad7ade15b93f22b17648d53ba20062',1,'std::bitset::operator[](size_t __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#afa6b9908b9752384b42da517a3ae3d8c',1,'std::bitset::operator[](size_t __position) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a461a433ad999e2d22e10f45addf1bb67',1,'std::deque::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a513a4ab26ac9df40d7ec95fc50e1218b',1,'std::deque::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a4a4a9f95131baf0713596d672ec36b5f',1,'std::map::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'std::match_results::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'std::match_results::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6021c27572ef3bc03cea38c66dde3783',1,'std::match_results::operator[](size_type __sub) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a4dadeeb9101dbd3d257043519e6e35f8',1,'std::reverse_iterator::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a7b05f8159b467622dc2804f276ecc8ea',1,'std::tr2::dynamic_bitset::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a78022be7125e50468596e2a0e0df4a3b',1,'std::tr2::dynamic_bitset::operator[](size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a7b05f8159b467622dc2804f276ecc8ea',1,'std::tr2::dynamic_bitset::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a78022be7125e50468596e2a0e0df4a3b',1,'std::tr2::dynamic_bitset::operator[](size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a6fb7ee5ca798c98fa24524f0df6edd59',1,'std::unique_ptr< _Tp[], _Dp >::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'std::unordered_map::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'std::unordered_map::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'std::unordered_map::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'std::unordered_map::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2325176078e58966124ec919df2b1eb4',1,'std::valarray::operator[](size_t __i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e86bbdb258433295ab39596449a5f7e',1,'std::valarray::operator[](slice __s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad5394a15e9c7edd4ecece4534d3c3ba3',1,'std::valarray::operator[](slice __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga28ef76e86bd06a99b58af17899554590',1,'std::valarray::operator[](const gslice &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gae5e23cc8dbbeee72c16868aad85731ba',1,'std::valarray::operator[](const gslice &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f454eb267fee574dadea61b69b94d31',1,'std::valarray::operator[](const valarray< bool > &__m) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga24fb191ad805190686652a3a8bf7169b',1,'std::valarray::operator[](const valarray< bool > &__m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2d1a225784345f3c5eb3e94e984e5e00',1,'std::valarray::operator[](const valarray< size_t > &__i) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafcd1719464554185069224f2fd837de3',1,'std::valarray::operator[](const valarray< size_t > &__i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'std::vector::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'std::vector::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2325176078e58966124ec919df2b1eb4',1,'valarray< size_t >::operator[](size_t __i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e86bbdb258433295ab39596449a5f7e',1,'valarray< size_t >::operator[](slice __s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad5394a15e9c7edd4ecece4534d3c3ba3',1,'valarray< size_t >::operator[](slice __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga28ef76e86bd06a99b58af17899554590',1,'valarray< size_t >::operator[](const gslice &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gae5e23cc8dbbeee72c16868aad85731ba',1,'valarray< size_t >::operator[](const gslice &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f454eb267fee574dadea61b69b94d31',1,'valarray< size_t >::operator[](const valarray< bool > &__m) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga24fb191ad805190686652a3a8bf7169b',1,'valarray< size_t >::operator[](const valarray< bool > &__m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2d1a225784345f3c5eb3e94e984e5e00',1,'valarray< size_t >::operator[](const valarray< size_t > &__i) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafcd1719464554185069224f2fd837de3',1,'valarray< size_t >::operator[](const valarray< size_t > &__i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< __diff_type >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< __diff_type >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _CharClassT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _CharClassT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _CharT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _CharT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _Cmpt >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _Cmpt >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _Node *, _Nodeptr_Alloc >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _Node *, _Nodeptr_Alloc >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _RealType >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _RealType >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _State< _TraitsT::char_type > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _State< _TraitsT::char_type > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _StringT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _StringT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< block_type, allocator_type >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< block_type, allocator_type >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< Catalog_info * >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< Catalog_info * >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< double >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< double >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< int >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< int >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< result_type >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< result_type >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< size_t >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< size_t >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< std::pair< _BiIter, int > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< std::pair< _BiIter, int > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< std::pair< _StateIdT, std::vector > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< std::pair< _StateIdT, std::vector > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< sub_match< _BiIter >, _Alloc >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< sub_match< _BiIter >, _Alloc >::operator[](size_type __n) const noexcept'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArithmeticSequence.html#a890959dd45db1bbee103c1861c53ffad',1,'Eigen::ArithmeticSequence::operator[]()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a496672306836589fa04a6ab33cb0cf2a',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::operator[]()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#aa2040f14e60fed1a4a68ca7f042e1bbf',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::operator[]()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9ea67fc1ef0ccc42e1d5388fe0416ae5.html#a9ea67fc1ef0ccc42e1d5388fe0416ae5',1,'nlohmann::basic_json::operator[](size_type idx)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad21d96f490fa1aa8605fba8dadcce319.html#ad21d96f490fa1aa8605fba8dadcce319',1,'nlohmann::basic_json::operator[](size_type idx) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3f45f3820c456ad2e3f3df2926564151.html#a3f45f3820c456ad2e3f3df2926564151',1,'nlohmann::basic_json::operator[](const typename object_t::key_type &key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_acb5b489310f4e0ce2d5fb29b73fb59d3.html#acb5b489310f4e0ce2d5fb29b73fb59d3',1,'nlohmann::basic_json::operator[](const typename object_t::key_type &key) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_abc94831476f7b4d3efe6f2e9036c7188.html#abc94831476f7b4d3efe6f2e9036c7188',1,'nlohmann::basic_json::operator[](T *key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a11bbe874496eb7b29a5549e0637de59e.html#a11bbe874496eb7b29a5549e0637de59e',1,'nlohmann::basic_json::operator[](T *key) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0d3deaa73b3644b4da3f8ef3172cd8d2.html#a0d3deaa73b3644b4da3f8ef3172cd8d2',1,'nlohmann::basic_json::operator[](const json_pointer &ptr)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0a691c29eb7c4acd91ccb498a79cd3ee.html#a0a691c29eb7c4acd91ccb498a79cd3ee',1,'nlohmann::basic_json::operator[](const json_pointer &ptr) const'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_ae7a1ca8c1e234837d137471f73ae6012.html#ae7a1ca8c1e234837d137471f73ae6012',1,'nlohmann::ordered_map::operator[](const Key &key)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a676082659d575e29bdb312bcde53023a.html#a676082659d575e29bdb312bcde53023a',1,'nlohmann::ordered_map::operator[](const Key &key) const'],['../classAR_1_1MarkerSet.html#abb1041eb9fc43bb7919406f08de27784',1,'AR::MarkerSet::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2325176078e58966124ec919df2b1eb4',1,'operator[](size_t __i)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e86bbdb258433295ab39596449a5f7e',1,'operator[](slice __s) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga28ef76e86bd06a99b58af17899554590',1,'operator[](const gslice &__s) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f454eb267fee574dadea61b69b94d31',1,'operator[](const valarray< bool > &__m) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2d1a225784345f3c5eb3e94e984e5e00',1,'operator[](const valarray< size_t > &__i) const(Global Namespace)']]], + ['operator_5e_334',['operator^',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9afbc19e8756efdbc92e17d096540ce5',1,'cv::MatExpr::operator^(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abc36e16ecd042df954771a99068a6c49',1,'cv::MatExpr::operator^(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9867b0d5e11c2fef494b71e51d21da1b',1,'cv::MatExpr::operator^(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a15cd0aff27ba61cb2563894b01547e7e',1,'cv::MatExpr::operator^(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac559f4bd48f3660ee56a223258dc6bb9',1,'cv::MatExpr::operator^(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9afbc19e8756efdbc92e17d096540ce5',1,'cv::MatExpr::operator^(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abc36e16ecd042df954771a99068a6c49',1,'cv::MatExpr::operator^(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9867b0d5e11c2fef494b71e51d21da1b',1,'cv::MatExpr::operator^(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a15cd0aff27ba61cb2563894b01547e7e',1,'cv::MatExpr::operator^(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac559f4bd48f3660ee56a223258dc6bb9',1,'cv::MatExpr::operator^(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga7c759a9f061d90e4c6dac60aa74fb986',1,'cv::operator^()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f2db1ff7a6beee9d6abb68fca5486',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19bb391512f5ba4c2fee17b49f482269',1,'cv::cudev::operator^(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6996ae50fe4252f163301d6440a5c244',1,'cv::cudev::operator^(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35bf74a15b738d8b54e7bc12bbae0993',1,'cv::cudev::operator^(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae841dcb6dd5dbac738ea6f92c8c68b68',1,'cv::cudev::operator^(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga382357929ae811bbfc4e808b4e3bc8f2',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b81aa937cefb46d9896886aeeaa883c',1,'cv::cudev::operator^(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68a8e460780b94e85614d7785cbd3cb2',1,'cv::cudev::operator^(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7067102ad5f321c066fa7f2db3566b63',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff97ad64d1178cb4f6022f6c046d9e19',1,'cv::cudev::operator^(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae05c59b91c6841b7b4513e54e6de72db',1,'cv::cudev::operator^(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga553a0ab64e059b30e81c8ab8802d1ddf',1,'cv::cudev::operator^(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce073b221be8f03e1af8d35b795efa5',1,'cv::cudev::operator^(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae247dcb0213e92795a12085731f99b49',1,'cv::cudev::operator^(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f61a3af63ded7c934b5859eefd1e108',1,'cv::cudev::operator^(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa347f52f3f818f094c59a9cdf1f18ae8',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fad8e805a97475f06edef6af6bf976c',1,'cv::cudev::operator^(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9546d5b0db6ba30340fb1d19a1428be',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee3dfc9cff4b1d5f64e0351e091d27f',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7221d69a134b0ef5b08e97bb968d0762',1,'cv::cudev::operator^(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68fca21ce958616bb3cce2827c81bcb1',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga219e0d330b1ae4f6c55ef2bc9cd61b54',1,'cv::cudev::operator^(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c7b83d9c2a632dacbcd26a6bc71fcb8',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc55eed4cb6100456719dd7d42ab840',1,'cv::cudev::operator^(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa05edd1f94210980d40ecd8615e6cd',1,'cv::cudev::operator^(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57b0beb61b6838a8997630c88d57b1c0',1,'cv::cudev::operator^(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga574dbf94893fb637932048a1da56f61e',1,'cv::cudev::operator^(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a2d82b647bfdd3d8b9f555255b08446',1,'cv::cudev::operator^(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67b57ea4eeeb2dfc404c0596ad12a003',1,'cv::cudev::operator^(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f084768a0834cb515abe7cc12e5a5c2',1,'cv::cudev::operator^(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga262bbf2d811490645625b3c0819db5a9',1,'cv::cudev::operator^(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9008ea56e80e41f137fae6c4f29c5e2c',1,'cv::cudev::operator^(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b226fe3a602b25eb493c5b47675b115',1,'cv::cudev::operator^(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f177c946e1c5b13bda7e1a4d6b14792',1,'cv::cudev::operator^(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba1a42db310a4daf0fb2865aaf7f5201',1,'cv::cudev::operator^(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb9bef1f86ce4022e33132f5a80b4ae',1,'cv::cudev::operator^(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeaf6f4ae0c4adbf3594389355fc10fc6',1,'cv::cudev::operator^(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6307095b70d98cfb7875659cd516c9d7',1,'cv::cudev::operator^(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga276ef3a39dccd5a558013568f8e10634',1,'cv::cudev::operator^(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b709e4bac601f7322655f2bdb989cae',1,'cv::cudev::operator^(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2081fb9edca3a8318295766946442143',1,'cv::cudev::operator^(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42a42be02e720782ac6d6a890f87df34',1,'cv::cudev::operator^(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf503ce80b70d5e95589c6bcc5dcdc534',1,'cv::cudev::operator^(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86b5ec62d72169a5af71fbef20395bf7',1,'cv::cudev::operator^(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc0fe10ccf8bffd6a42d61a2cb7b7630',1,'cv::cudev::operator^(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29e1fa7243c5a45d5b4a8333ef5e4ad4',1,'cv::cudev::operator^(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace59218cd1224e9bd4e71d44effb706e',1,'cv::cudev::operator^(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb305d044d1d79eaa26884fa8691b13c',1,'cv::cudev::operator^(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92297263151c479220003960e6c94826',1,'cv::cudev::operator^(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23dec7e74c18bf4befb0e357ffada712',1,'cv::cudev::operator^(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc8b1ea1436679399d6de28a93f37c7c',1,'cv::cudev::operator^(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cdbc34390912374b3c016740db6e5a1',1,'cv::cudev::operator^(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga562e145a0cc65fa6571d18d0b5304fcd',1,'cv::cudev::operator^(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1487d3dd6d9e842c3f266fdef9b3cd06',1,'cv::cudev::operator^(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bdf640af5ef6c8037f04d2a21f72624',1,'cv::cudev::operator^(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be79933bce514a940a915865400b1be',1,'cv::cudev::operator^(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa8c7b4fcf0364baf63899bab7585b4',1,'cv::cudev::operator^(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c856e8c20c27045d1016b675fea6c29',1,'cv::cudev::operator^(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a4d4f19b1228d8c35964c9631b12db1',1,'cv::cudev::operator^(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc9f85f2cd8647cac819333b0b5d90d2',1,'cv::cudev::operator^(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed751d867269bace54872e57a083af43',1,'cv::cudev::operator^(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9d23aba1973ca8fd1ea7c710c89d9c9',1,'cv::cudev::operator^(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a5b7d75125123f6c481b6b5335baf5',1,'cv::cudev::operator^(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1860e2d6fbcabfd958136c1d2a873565',1,'cv::cudev::operator^(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7064aa0e201b06e6456b7225ab13b76f',1,'cv::cudev::operator^(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182950bf07b543f15aef63a570a75740',1,'cv::cudev::operator^(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7cb4644f2a37866175abd213e99bf9c',1,'cv::cudev::operator^(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga106351f7f67aac5a4539cf2da429051b',1,'cv::cudev::operator^(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5c2aa1114fc5bc919fecf84836a85bb',1,'cv::cudev::operator^(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e81b5c59f5873a9b2b355605d4628c4',1,'cv::cudev::operator^(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24aac76e0a255dbf62c78f3f5ac1b4d6',1,'cv::cudev::operator^(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7de7a8c28d3b5cc29651d6128ca2d910',1,'cv::cudev::operator^(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f1c529d765c81d140c77108626aa14a',1,'cv::cudev::operator^(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef0821f6c671d9712c7238465f8d4884',1,'cv::cudev::operator^(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2daad5e0b4930181e2e66c9f17f93c20',1,'cv::cudev::operator^(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ff5a2a334e85c74b8286600064aae8b',1,'cv::cudev::operator^(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63ccaabd5ee595473b9dc5bd77d9948e',1,'cv::cudev::operator^(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab653e7053862a95e577b8db3322dd49c',1,'cv::cudev::operator^(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6976070c4b0ebc9d2ac34bc7c325b112',1,'cv::cudev::operator^(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147cb8d515df77bc9dda9bd957c21a75',1,'cv::cudev::operator^(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8caa79576d2640d9c571dcbf39c41f9e',1,'cv::cudev::operator^(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga536c9c60a5f68e761b71f7a521bd440f',1,'cv::cudev::operator^(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga309e3255d388c6334fa4baccb66c39c4',1,'cv::cudev::operator^(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga844cecceba28036b2ef12a014b0ccfb7',1,'cv::cudev::operator^(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga930dfc19c86c269dba903a06651d79b1',1,'cv::cudev::operator^(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc31b023630642daa958687ede735dc',1,'cv::cudev::operator^(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga260712aebe5466a8e4f01ea498d2ca02',1,'cv::cudev::operator^(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09aac80f9054e642a162795b850c973b',1,'cv::cudev::operator^(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056a095b396077c1a14f6e237ba69f62',1,'cv::cudev::operator^(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4424230c30d8785f0c7ecb0903651540',1,'cv::cudev::operator^(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b85716ad8e68247c20bbf301d5db78b',1,'cv::cudev::operator^(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61455fe5de691c1102ebec11128de52a',1,'cv::cudev::operator^(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga754806ed446290afea054d4cab646e54',1,'cv::cudev::operator^(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd6445fdc04ff5606d05f981dac957ee',1,'cv::cudev::operator^(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3903754f858daaf6174edeec6c964db1',1,'cv::cudev::operator^(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ae473eb2417fa915fb5d169be28d0d6',1,'cv::cudev::operator^(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga7c759a9f061d90e4c6dac60aa74fb986',1,'operator^(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f2db1ff7a6beee9d6abb68fca5486',1,'operator^(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19bb391512f5ba4c2fee17b49f482269',1,'operator^(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6996ae50fe4252f163301d6440a5c244',1,'operator^(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35bf74a15b738d8b54e7bc12bbae0993',1,'operator^(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae841dcb6dd5dbac738ea6f92c8c68b68',1,'operator^(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga382357929ae811bbfc4e808b4e3bc8f2',1,'operator^(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b81aa937cefb46d9896886aeeaa883c',1,'operator^(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68a8e460780b94e85614d7785cbd3cb2',1,'operator^(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7067102ad5f321c066fa7f2db3566b63',1,'operator^(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff97ad64d1178cb4f6022f6c046d9e19',1,'operator^(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae05c59b91c6841b7b4513e54e6de72db',1,'operator^(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga553a0ab64e059b30e81c8ab8802d1ddf',1,'operator^(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce073b221be8f03e1af8d35b795efa5',1,'operator^(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae247dcb0213e92795a12085731f99b49',1,'operator^(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f61a3af63ded7c934b5859eefd1e108',1,'operator^(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa347f52f3f818f094c59a9cdf1f18ae8',1,'operator^(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fad8e805a97475f06edef6af6bf976c',1,'operator^(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9546d5b0db6ba30340fb1d19a1428be',1,'operator^(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee3dfc9cff4b1d5f64e0351e091d27f',1,'operator^(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7221d69a134b0ef5b08e97bb968d0762',1,'operator^(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68fca21ce958616bb3cce2827c81bcb1',1,'operator^(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga219e0d330b1ae4f6c55ef2bc9cd61b54',1,'operator^(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c7b83d9c2a632dacbcd26a6bc71fcb8',1,'operator^(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc55eed4cb6100456719dd7d42ab840',1,'operator^(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa05edd1f94210980d40ecd8615e6cd',1,'operator^(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57b0beb61b6838a8997630c88d57b1c0',1,'operator^(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga574dbf94893fb637932048a1da56f61e',1,'operator^(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a2d82b647bfdd3d8b9f555255b08446',1,'operator^(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67b57ea4eeeb2dfc404c0596ad12a003',1,'operator^(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f084768a0834cb515abe7cc12e5a5c2',1,'operator^(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga262bbf2d811490645625b3c0819db5a9',1,'operator^(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9008ea56e80e41f137fae6c4f29c5e2c',1,'operator^(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b226fe3a602b25eb493c5b47675b115',1,'operator^(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f177c946e1c5b13bda7e1a4d6b14792',1,'operator^(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba1a42db310a4daf0fb2865aaf7f5201',1,'operator^(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb9bef1f86ce4022e33132f5a80b4ae',1,'operator^(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeaf6f4ae0c4adbf3594389355fc10fc6',1,'operator^(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6307095b70d98cfb7875659cd516c9d7',1,'operator^(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga276ef3a39dccd5a558013568f8e10634',1,'operator^(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b709e4bac601f7322655f2bdb989cae',1,'operator^(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2081fb9edca3a8318295766946442143',1,'operator^(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42a42be02e720782ac6d6a890f87df34',1,'operator^(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf503ce80b70d5e95589c6bcc5dcdc534',1,'operator^(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86b5ec62d72169a5af71fbef20395bf7',1,'operator^(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc0fe10ccf8bffd6a42d61a2cb7b7630',1,'operator^(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29e1fa7243c5a45d5b4a8333ef5e4ad4',1,'operator^(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace59218cd1224e9bd4e71d44effb706e',1,'operator^(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb305d044d1d79eaa26884fa8691b13c',1,'operator^(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92297263151c479220003960e6c94826',1,'operator^(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23dec7e74c18bf4befb0e357ffada712',1,'operator^(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc8b1ea1436679399d6de28a93f37c7c',1,'operator^(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cdbc34390912374b3c016740db6e5a1',1,'operator^(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga562e145a0cc65fa6571d18d0b5304fcd',1,'operator^(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1487d3dd6d9e842c3f266fdef9b3cd06',1,'operator^(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bdf640af5ef6c8037f04d2a21f72624',1,'operator^(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be79933bce514a940a915865400b1be',1,'operator^(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa8c7b4fcf0364baf63899bab7585b4',1,'operator^(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c856e8c20c27045d1016b675fea6c29',1,'operator^(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a4d4f19b1228d8c35964c9631b12db1',1,'operator^(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc9f85f2cd8647cac819333b0b5d90d2',1,'operator^(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed751d867269bace54872e57a083af43',1,'operator^(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9d23aba1973ca8fd1ea7c710c89d9c9',1,'operator^(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a5b7d75125123f6c481b6b5335baf5',1,'operator^(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1860e2d6fbcabfd958136c1d2a873565',1,'operator^(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7064aa0e201b06e6456b7225ab13b76f',1,'operator^(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182950bf07b543f15aef63a570a75740',1,'operator^(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7cb4644f2a37866175abd213e99bf9c',1,'operator^(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga106351f7f67aac5a4539cf2da429051b',1,'operator^(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5c2aa1114fc5bc919fecf84836a85bb',1,'operator^(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e81b5c59f5873a9b2b355605d4628c4',1,'operator^(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24aac76e0a255dbf62c78f3f5ac1b4d6',1,'operator^(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7de7a8c28d3b5cc29651d6128ca2d910',1,'operator^(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f1c529d765c81d140c77108626aa14a',1,'operator^(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef0821f6c671d9712c7238465f8d4884',1,'operator^(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2daad5e0b4930181e2e66c9f17f93c20',1,'operator^(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ff5a2a334e85c74b8286600064aae8b',1,'operator^(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63ccaabd5ee595473b9dc5bd77d9948e',1,'operator^(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab653e7053862a95e577b8db3322dd49c',1,'operator^(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6976070c4b0ebc9d2ac34bc7c325b112',1,'operator^(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147cb8d515df77bc9dda9bd957c21a75',1,'operator^(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8caa79576d2640d9c571dcbf39c41f9e',1,'operator^(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga536c9c60a5f68e761b71f7a521bd440f',1,'operator^(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga309e3255d388c6334fa4baccb66c39c4',1,'operator^(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga844cecceba28036b2ef12a014b0ccfb7',1,'operator^(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga930dfc19c86c269dba903a06651d79b1',1,'operator^(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc31b023630642daa958687ede735dc',1,'operator^(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga260712aebe5466a8e4f01ea498d2ca02',1,'operator^(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09aac80f9054e642a162795b850c973b',1,'operator^(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056a095b396077c1a14f6e237ba69f62',1,'operator^(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4424230c30d8785f0c7ecb0903651540',1,'operator^(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b85716ad8e68247c20bbf301d5db78b',1,'operator^(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61455fe5de691c1102ebec11128de52a',1,'operator^(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga754806ed446290afea054d4cab646e54',1,'operator^(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd6445fdc04ff5606d05f981dac957ee',1,'operator^(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3903754f858daaf6174edeec6c964db1',1,'operator^(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ae473eb2417fa915fb5d169be28d0d6',1,'operator^(uint s, const uint4 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0eec0ec1834b05e931022533e2ae4d03',1,'std::operator^()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a99429d2419718d6f9cf98153cb104a57',1,'std::regex_constants::operator^(syntax_option_type __a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ac6b912c67d2cdd494a770cd23c1b4f98',1,'std::regex_constants::operator^(match_flag_type __a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga7c9b5309fab61ddf049e350fdaa599fe',1,'std::tr2::operator^()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga7c9b5309fab61ddf049e350fdaa599fe',1,'operator^()(Global Namespace)']]], + ['operator_5e_3d_335',['operator^=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa9ac8697d02b2a3bacc58b1fa619b630',1,'std::bitset::operator^=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa9ac8697d02b2a3bacc58b1fa619b630',1,'std::bitset::operator^=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa45daae152fd32ab851c56779fc1e13c',1,'std::gslice_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga335663b1692606f8a5d96324592d4785',1,'std::indirect_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab7b73360db81555ebc04e3c482a94857',1,'std::mask_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga262449de3e39bbae18ab3bb911b2eb8b',1,'std::slice_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#adf5d449d2357108981b85b43f05114e7',1,'std::tr2::dynamic_bitset::operator^=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#adf5d449d2357108981b85b43f05114e7',1,'std::tr2::dynamic_bitset::operator^=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga12372c525f0ae4cdeb7180c7337b57ed',1,'std::valarray::operator^=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga945c098affa36e4df42895bca9937b61',1,'std::valarray::operator^=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga12372c525f0ae4cdeb7180c7337b57ed',1,'valarray< size_t >::operator^=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga945c098affa36e4df42895bca9937b61',1,'valarray< size_t >::operator^=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gadd58fb6b2720ce0e68d9665ddee198f9',1,'cv::operator^=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gadd58fb6b2720ce0e68d9665ddee198f9',1,'operator^=()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a782f3bd1b71adf5bc9f337b74ccb169d',1,'std::regex_constants::operator^=(syntax_option_type &__a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a6edeffe99c8db99f7d365da413e65c34',1,'std::regex_constants::operator^=(match_flag_type &__a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa45daae152fd32ab851c56779fc1e13c',1,'operator^=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga12372c525f0ae4cdeb7180c7337b57ed',1,'operator^=(const _Tp &)(Global Namespace)']]], + ['operatorinversesqrt_336',['operatorInverseSqrt',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#ae4b13fe4ce22faf74e50d346fc51a66e',1,'Eigen::SelfAdjointEigenSolver']]], + ['operatornorm_337',['operatorNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ff9bc0b9bea2d0822a2bf3192783102',1,'Eigen::MatrixBase::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ff9bc0b9bea2d0822a2bf3192783102',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ff9bc0b9bea2d0822a2bf3192783102',1,'MatrixBase< Solve< Decomposition, RhsType > >::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a12a7da482e31ec9c517dca92dd7bae61',1,'Eigen::SelfAdjointView::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a12a7da482e31ec9c517dca92dd7bae61',1,'SelfAdjointView< const Derived, UpLo >::operatorNorm()']]], + ['operators_2ehpp_338',['operators.hpp',['https://docs.opencv.org/4.2.0/dd/dcd/operators_8hpp.html',1,'']]], + ['operatorsqrt_339',['operatorSqrt',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#aeeedb2ae618f21a4eb59465746c1cee5',1,'Eigen::SelfAdjointEigenSolver']]], + ['operator_7c_340',['operator|',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8938333ac6cc65c2cc4a21071b22df56',1,'cv::MatExpr::operator|(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aeac05ffd3d5c1d6c803e46a5ed380a95',1,'cv::MatExpr::operator|(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27c1238f43dfbf691c3da8b9bcbe8622',1,'cv::MatExpr::operator|(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acaa29c7d0f130d120737fcb3c5dac54d',1,'cv::MatExpr::operator|(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aab1250c235649a10a478a88394b23fda',1,'cv::MatExpr::operator|(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8938333ac6cc65c2cc4a21071b22df56',1,'cv::MatExpr::operator|(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aeac05ffd3d5c1d6c803e46a5ed380a95',1,'cv::MatExpr::operator|(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27c1238f43dfbf691c3da8b9bcbe8622',1,'cv::MatExpr::operator|(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acaa29c7d0f130d120737fcb3c5dac54d',1,'cv::MatExpr::operator|(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aab1250c235649a10a478a88394b23fda',1,'cv::MatExpr::operator|(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga08e30fb25ccd0e148c11eab8f9b0daaf',1,'cv::operator|()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72373b516825ad78e4c3db1918858a03',1,'cv::cudev::operator|(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6817a3e829bea52da01ea49c16839597',1,'cv::cudev::operator|(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b61ec46777577e1395990626361d82',1,'cv::cudev::operator|(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e5ac5a0d8c733bee304065ea5d10c5c',1,'cv::cudev::operator|(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb491ada5fa699f281393e20bad19c59',1,'cv::cudev::operator|(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga140d231543d1ec29d211aa7b6aae1f9e',1,'cv::cudev::operator|(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeec118fb2a44a56ccc4242809ef2ee45',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8765a933b0b5adf61c098fbf191a8f69',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga494eb039f25f4b355015e048e65ae92a',1,'cv::cudev::operator|(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67f56e5f79c0c5a8d35924a320e8035',1,'cv::cudev::operator|(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7e1dd96697340c2af8b08e71f65f058',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga214e51557127c9dbf5822af3b7e4086f',1,'cv::cudev::operator|(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbf444dd7ea65e673b383fdc24b7b9bc',1,'cv::cudev::operator|(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71bf7e7b2a0722518d460c2ef26bd009',1,'cv::cudev::operator|(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4c0138f513cd7e6f2ec5c673baa9430',1,'cv::cudev::operator|(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630597efc5d5a29f689f5f73b6cc2057',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79dea7d19820e4a739fb7927daff522f',1,'cv::cudev::operator|(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a62899f4dfb4a4a51fc9e18ced6b236',1,'cv::cudev::operator|(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ebd78b7e25610fdca444e53b9124af1',1,'cv::cudev::operator|(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga619519d7e0cbc71f88dcf10af8bdc3e4',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad952cc55d6204ec9648e8e226307f433',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99e794f6c32bf7a1e18e28e5cd76b3f0',1,'cv::cudev::operator|(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6285d927a8d75294be444e2923d4015d',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddeb8331934690f04aca52ec3d485468',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eae7ed305c1f6f0d697cf6b5513b52c',1,'cv::cudev::operator|(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48ef824b54938a4efab1d92d2547b6ff',1,'cv::cudev::operator|(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b91ed6a653874c97911addea7492e88',1,'cv::cudev::operator|(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a7ba688aec7b3bc93dfd03efb7a0a1',1,'cv::cudev::operator|(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0df3c76006f995c76b73f820597058d3',1,'cv::cudev::operator|(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33dc3b6cc908d682b8b4b924037462a8',1,'cv::cudev::operator|(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa67b59a7a6af82dad9017aeb8a9af3',1,'cv::cudev::operator|(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3471e18d63b852c4eb063e1ccf2a9d1',1,'cv::cudev::operator|(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e682a0014ba8daf79be5ea7b234da6f',1,'cv::cudev::operator|(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6cb1874e00d5f309b08b23fa3135867',1,'cv::cudev::operator|(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e888e4f12d42f958c274ae74b5b8fcf',1,'cv::cudev::operator|(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga926b508cb3586f7e8b26e7ab4f3a36d9',1,'cv::cudev::operator|(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga347152b541965b0706b8883c77ab59d1',1,'cv::cudev::operator|(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b428f7caf6c47e78c4ee870da69a5bb',1,'cv::cudev::operator|(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f6ed6bde6e724a15b3d462ad5fff304',1,'cv::cudev::operator|(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755c6b9eed56b86c14c166120150cf5a',1,'cv::cudev::operator|(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ac29af04d3ff28282099ae43d64c1eb',1,'cv::cudev::operator|(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5168caae872a1693252bf524ca06a971',1,'cv::cudev::operator|(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b04c7e2bf05018eff5107b8b21d834f',1,'cv::cudev::operator|(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fa19097be382eb043bc1947c99527bf',1,'cv::cudev::operator|(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dc4e4e7647a0a14bfaf036a293f7c20',1,'cv::cudev::operator|(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c4229c9c4d01aae2eb3c68b6d295a5d',1,'cv::cudev::operator|(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga089d5fc24f8caba2cd4157d4c72acd16',1,'cv::cudev::operator|(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4df0525a2ea1daa49391935fd6096f82',1,'cv::cudev::operator|(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a144b52934da855d744f0f6821ad443',1,'cv::cudev::operator|(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41753a5acd49f58734c7f0b2b906c820',1,'cv::cudev::operator|(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga066869163b1bdbd4100bdc23a675e905',1,'cv::cudev::operator|(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0631c1ac1e1d609ce0a5a20bc12d61a5',1,'cv::cudev::operator|(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64863e5f445a3cb5b5f5900dbb2d1cb6',1,'cv::cudev::operator|(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga843f54b435b967d9fcb1259ebe47d149',1,'cv::cudev::operator|(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4f44f5d07e21c6d6e891fe50f7a95c3',1,'cv::cudev::operator|(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e22900c73b91968a336722095dee82f',1,'cv::cudev::operator|(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19056ea37b866c0f7f7e47b9d1d06c56',1,'cv::cudev::operator|(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga153845e401bd20e6df63bedfaf7d7740',1,'cv::cudev::operator|(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efc7c5881e23be48037958261a0496f',1,'cv::cudev::operator|(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85a70d4dfeb3063b32cbe3db7f75cb8a',1,'cv::cudev::operator|(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga305080aaf14a3ac0997ad739d57372c7',1,'cv::cudev::operator|(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a0a8103dfd6807e20fcd226e5cd3aec',1,'cv::cudev::operator|(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14769e6c0a5b2888af00d0ceb63fc090',1,'cv::cudev::operator|(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b29a922cca4534da997e1800dbccc0f',1,'cv::cudev::operator|(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1cc5655efe72e5d9e95279d76e1d48e',1,'cv::cudev::operator|(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd8cbff79c1cace2db279f6de7a0681',1,'cv::cudev::operator|(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac38b34c8a76b66b0466166192db5d2e6',1,'cv::cudev::operator|(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236fa0260af6ef2b14fadba155fe5abe',1,'cv::cudev::operator|(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37dad1dbb748b11a1193be946b3722a1',1,'cv::cudev::operator|(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9803d4b0e3d1a0167830a72715b0c04e',1,'cv::cudev::operator|(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77b5075254d12609ad87bed4527633a4',1,'cv::cudev::operator|(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf719b791735f78195bfe29926f1b0ab7',1,'cv::cudev::operator|(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3689763321a43eacdd8d773eb2c70712',1,'cv::cudev::operator|(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572df6ef6d0112b56753ba4014881e53',1,'cv::cudev::operator|(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6457d3d1d93c0166976483a2f951ee3d',1,'cv::cudev::operator|(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91b74f2c70bcedc67c9df84a02addb79',1,'cv::cudev::operator|(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a47b495c6be9943d7cd3a7f7fd616f',1,'cv::cudev::operator|(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab07096b3294af7bcec98722b2446e479',1,'cv::cudev::operator|(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ed7b2138bc1f9497aa3c07b3dd5a07f',1,'cv::cudev::operator|(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaace76c0789620825414ff7a595ef5911',1,'cv::cudev::operator|(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6a261516077c0b79a742b166cfc07a0',1,'cv::cudev::operator|(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16512210aee4858a3ab481592bf74f1c',1,'cv::cudev::operator|(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2438bf2b14756d6e5ed3bad3b3c1e1ec',1,'cv::cudev::operator|(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ae3b6aa8f01802bd73dc969d72fabc5',1,'cv::cudev::operator|(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ead05d032040865f64cd3f8f1e0547',1,'cv::cudev::operator|(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62e550301aa3c7d81e282e7b5eb3020a',1,'cv::cudev::operator|(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac167061f4c1ca73369f88716e8989984',1,'cv::cudev::operator|(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafe49b72410fc249acf6ec30c4af1de5',1,'cv::cudev::operator|(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0385791a7e492043910a3c6d9633f1e',1,'cv::cudev::operator|(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f53c51e5f229c2d88d5820a0c1bf963',1,'cv::cudev::operator|(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef6dcabe2a6d79eb4f75768d54ddb701',1,'cv::cudev::operator|(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ccfb5c0cc94544213a31f2cca13c615',1,'cv::cudev::operator|(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32e508cfe66f331a33b2f3da6e900404',1,'cv::cudev::operator|(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga085e8a5af5cec776858566322bde16fe',1,'cv::cudev::operator|(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3050373d10dc996186ca8f35ae0d0bf',1,'cv::cudev::operator|(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24144ec0fb8b6b445ab0a1ee9e41da15',1,'cv::cudev::operator|(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga08e30fb25ccd0e148c11eab8f9b0daaf',1,'operator|(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72373b516825ad78e4c3db1918858a03',1,'operator|(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6817a3e829bea52da01ea49c16839597',1,'operator|(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b61ec46777577e1395990626361d82',1,'operator|(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e5ac5a0d8c733bee304065ea5d10c5c',1,'operator|(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb491ada5fa699f281393e20bad19c59',1,'operator|(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga140d231543d1ec29d211aa7b6aae1f9e',1,'operator|(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeec118fb2a44a56ccc4242809ef2ee45',1,'operator|(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8765a933b0b5adf61c098fbf191a8f69',1,'operator|(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga494eb039f25f4b355015e048e65ae92a',1,'operator|(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67f56e5f79c0c5a8d35924a320e8035',1,'operator|(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7e1dd96697340c2af8b08e71f65f058',1,'operator|(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga214e51557127c9dbf5822af3b7e4086f',1,'operator|(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbf444dd7ea65e673b383fdc24b7b9bc',1,'operator|(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71bf7e7b2a0722518d460c2ef26bd009',1,'operator|(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4c0138f513cd7e6f2ec5c673baa9430',1,'operator|(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630597efc5d5a29f689f5f73b6cc2057',1,'operator|(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79dea7d19820e4a739fb7927daff522f',1,'operator|(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a62899f4dfb4a4a51fc9e18ced6b236',1,'operator|(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ebd78b7e25610fdca444e53b9124af1',1,'operator|(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga619519d7e0cbc71f88dcf10af8bdc3e4',1,'operator|(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad952cc55d6204ec9648e8e226307f433',1,'operator|(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99e794f6c32bf7a1e18e28e5cd76b3f0',1,'operator|(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6285d927a8d75294be444e2923d4015d',1,'operator|(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddeb8331934690f04aca52ec3d485468',1,'operator|(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eae7ed305c1f6f0d697cf6b5513b52c',1,'operator|(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48ef824b54938a4efab1d92d2547b6ff',1,'operator|(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b91ed6a653874c97911addea7492e88',1,'operator|(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a7ba688aec7b3bc93dfd03efb7a0a1',1,'operator|(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0df3c76006f995c76b73f820597058d3',1,'operator|(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33dc3b6cc908d682b8b4b924037462a8',1,'operator|(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa67b59a7a6af82dad9017aeb8a9af3',1,'operator|(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3471e18d63b852c4eb063e1ccf2a9d1',1,'operator|(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e682a0014ba8daf79be5ea7b234da6f',1,'operator|(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6cb1874e00d5f309b08b23fa3135867',1,'operator|(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e888e4f12d42f958c274ae74b5b8fcf',1,'operator|(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga926b508cb3586f7e8b26e7ab4f3a36d9',1,'operator|(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga347152b541965b0706b8883c77ab59d1',1,'operator|(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b428f7caf6c47e78c4ee870da69a5bb',1,'operator|(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f6ed6bde6e724a15b3d462ad5fff304',1,'operator|(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755c6b9eed56b86c14c166120150cf5a',1,'operator|(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ac29af04d3ff28282099ae43d64c1eb',1,'operator|(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5168caae872a1693252bf524ca06a971',1,'operator|(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b04c7e2bf05018eff5107b8b21d834f',1,'operator|(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fa19097be382eb043bc1947c99527bf',1,'operator|(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dc4e4e7647a0a14bfaf036a293f7c20',1,'operator|(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c4229c9c4d01aae2eb3c68b6d295a5d',1,'operator|(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga089d5fc24f8caba2cd4157d4c72acd16',1,'operator|(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4df0525a2ea1daa49391935fd6096f82',1,'operator|(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a144b52934da855d744f0f6821ad443',1,'operator|(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41753a5acd49f58734c7f0b2b906c820',1,'operator|(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga066869163b1bdbd4100bdc23a675e905',1,'operator|(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0631c1ac1e1d609ce0a5a20bc12d61a5',1,'operator|(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64863e5f445a3cb5b5f5900dbb2d1cb6',1,'operator|(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga843f54b435b967d9fcb1259ebe47d149',1,'operator|(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4f44f5d07e21c6d6e891fe50f7a95c3',1,'operator|(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e22900c73b91968a336722095dee82f',1,'operator|(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19056ea37b866c0f7f7e47b9d1d06c56',1,'operator|(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga153845e401bd20e6df63bedfaf7d7740',1,'operator|(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efc7c5881e23be48037958261a0496f',1,'operator|(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85a70d4dfeb3063b32cbe3db7f75cb8a',1,'operator|(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga305080aaf14a3ac0997ad739d57372c7',1,'operator|(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a0a8103dfd6807e20fcd226e5cd3aec',1,'operator|(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14769e6c0a5b2888af00d0ceb63fc090',1,'operator|(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b29a922cca4534da997e1800dbccc0f',1,'operator|(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1cc5655efe72e5d9e95279d76e1d48e',1,'operator|(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd8cbff79c1cace2db279f6de7a0681',1,'operator|(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac38b34c8a76b66b0466166192db5d2e6',1,'operator|(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236fa0260af6ef2b14fadba155fe5abe',1,'operator|(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37dad1dbb748b11a1193be946b3722a1',1,'operator|(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9803d4b0e3d1a0167830a72715b0c04e',1,'operator|(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77b5075254d12609ad87bed4527633a4',1,'operator|(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf719b791735f78195bfe29926f1b0ab7',1,'operator|(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3689763321a43eacdd8d773eb2c70712',1,'operator|(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572df6ef6d0112b56753ba4014881e53',1,'operator|(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6457d3d1d93c0166976483a2f951ee3d',1,'operator|(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91b74f2c70bcedc67c9df84a02addb79',1,'operator|(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a47b495c6be9943d7cd3a7f7fd616f',1,'operator|(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab07096b3294af7bcec98722b2446e479',1,'operator|(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ed7b2138bc1f9497aa3c07b3dd5a07f',1,'operator|(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaace76c0789620825414ff7a595ef5911',1,'operator|(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6a261516077c0b79a742b166cfc07a0',1,'operator|(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16512210aee4858a3ab481592bf74f1c',1,'operator|(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2438bf2b14756d6e5ed3bad3b3c1e1ec',1,'operator|(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ae3b6aa8f01802bd73dc969d72fabc5',1,'operator|(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ead05d032040865f64cd3f8f1e0547',1,'operator|(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62e550301aa3c7d81e282e7b5eb3020a',1,'operator|(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac167061f4c1ca73369f88716e8989984',1,'operator|(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafe49b72410fc249acf6ec30c4af1de5',1,'operator|(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0385791a7e492043910a3c6d9633f1e',1,'operator|(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f53c51e5f229c2d88d5820a0c1bf963',1,'operator|(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef6dcabe2a6d79eb4f75768d54ddb701',1,'operator|(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ccfb5c0cc94544213a31f2cca13c615',1,'operator|(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32e508cfe66f331a33b2f3da6e900404',1,'operator|(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga085e8a5af5cec776858566322bde16fe',1,'operator|(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3050373d10dc996186ca8f35ae0d0bf',1,'operator|(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24144ec0fb8b6b445ab0a1ee9e41da15',1,'operator|(const uint3 &a, uint s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a37b7f9acb3d4f471410857a524425f03',1,'std::operator|()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#aed34b3d93916973cfea2af94c22ac505',1,'std::regex_constants::operator|(syntax_option_type __a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a510d0810f0fe55a65a1f3ad142e95e2c',1,'std::regex_constants::operator|(match_flag_type __a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gad20c154d9a0dc8523781b0d2fe0d3de1',1,'std::tr2::operator|()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gad20c154d9a0dc8523781b0d2fe0d3de1',1,'operator|()(Global Namespace)']]], + ['operator_7c_3d_341',['operator|=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a75853927c9ad1aa9548e9eea7fde188c',1,'std::bitset::operator|=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a75853927c9ad1aa9548e9eea7fde188c',1,'std::bitset::operator|=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga87a6054e3d3df9b3b828c86d7b71a7d0',1,'std::gslice_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga349500cff6b300c39a505e9c74943b86',1,'std::indirect_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga684708f251addb2566756f4d2eedee36',1,'std::mask_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0cfe83bfd0c60d5f1b393bbddcc70889',1,'std::slice_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a4db104deaf30025db9b8064f29fa29f8',1,'std::tr2::dynamic_bitset::operator|=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a4db104deaf30025db9b8064f29fa29f8',1,'std::tr2::dynamic_bitset::operator|=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf20cc6bf249d338dd1fdb26f4363ee2e',1,'std::valarray::operator|=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2082939513c0702ce488c2dc27e98951',1,'std::valarray::operator|=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf20cc6bf249d338dd1fdb26f4363ee2e',1,'valarray< size_t >::operator|=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2082939513c0702ce488c2dc27e98951',1,'valarray< size_t >::operator|=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaad93bb02fc5c3c4c248b1dbb8a7348fe',1,'cv::operator|=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaad93bb02fc5c3c4c248b1dbb8a7348fe',1,'operator|=()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a4bd5dcfb1f0eead5b8f66233f45638f4',1,'std::regex_constants::operator|=(syntax_option_type &__a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a1cc70d79ada227928c10a6ae955a5527',1,'std::regex_constants::operator|=(match_flag_type &__a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga87a6054e3d3df9b3b828c86d7b71a7d0',1,'operator|=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf20cc6bf249d338dd1fdb26f4363ee2e',1,'operator|=(const _Tp &)(Global Namespace)']]], + ['operator_7c_7c_342',['operator||',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade405ae7fba00188385f79da087b473d',1,'cv::cudev::operator||(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67336d4da1a1a0e097576e110e322d17',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d9325273f75ec46a5d0ccaa698dcab2',1,'cv::cudev::operator||(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a350991d905802482a4a52516296256',1,'cv::cudev::operator||(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd38e92dca97e14285cb0a994eac2eb2',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1cf8719bfe35c1ce58b69439440ebb',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga407966ca821a5b21a0fa3669273ce155',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3f1b3a6297712114fb1528180bf4d5d',1,'cv::cudev::operator||(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa60211ccc7148f580c9213f98d57d852',1,'cv::cudev::operator||(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc492c09a30238356c29f992f434bbb',1,'cv::cudev::operator||(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab229fbb04aea1adaf4ad5a99495035b9',1,'cv::cudev::operator||(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac068c500d749dcf1c1b633a71343bf64',1,'cv::cudev::operator||(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfceb475fab9bf020cc18a7d00ce68fa',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga970bfbba082e36b082ec64f178fa4bc4',1,'cv::cudev::operator||(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451cabb9165a8cb76c8b8281a48a74c3',1,'cv::cudev::operator||(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ed51988f3b066b935628ca0ca76c806',1,'cv::cudev::operator||(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56be341fd82bc471dc3727ac767df94d',1,'cv::cudev::operator||(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43139046dc0327bc12a3405a63c93e78',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga759c70e663c4ff4e8d2ae8217d47a7d7',1,'cv::cudev::operator||(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64af392441e02098f668b91b581d6158',1,'cv::cudev::operator||(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9dfe768a49878db05bdb91ebe5a8759b',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga292fb2e70406a170f98347e3d2110db8',1,'cv::cudev::operator||(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20d93bcf778f16d1853957cc42ff9eab',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce18a713dc4adf2e6fc8841b69a7639',1,'cv::cudev::operator||(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf45510b81f8e1759112cecd4b5a4aa3',1,'cv::cudev::operator||(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fe1c8b48957c39413aac5e3ffd90376',1,'cv::cudev::operator||(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b56bd1f805e2cc2a433d784ea26764b',1,'cv::cudev::operator||(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51f6411482c1c1dc459307997d262caa',1,'cv::cudev::operator||(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae01ca019d7b9f4b726b7017dccfb97eb',1,'cv::cudev::operator||(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c9b224b12822bc42b33d5371cf7cef4',1,'cv::cudev::operator||(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdb8f03f5e8aded2d1c1f5b674f8d0be',1,'cv::cudev::operator||(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga682b9e8e6d24725fbfd14afe04c746cc',1,'cv::cudev::operator||(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f2c04274bc2e9ef0c0e64e835272570',1,'cv::cudev::operator||(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9613bf79ecb44e0124d987c0dc603c0e',1,'cv::cudev::operator||(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96c371efcc9fa6314c3997cabac8de8e',1,'cv::cudev::operator||(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebbcb4c326b4d6504cd9400ac933f53e',1,'cv::cudev::operator||(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6a798890ec4e1c957610419cbc07fa3',1,'cv::cudev::operator||(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0637cf031452de7f45462f4cf7d20f0',1,'cv::cudev::operator||(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3532b09926ae239bbfdcb638f8602895',1,'cv::cudev::operator||(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga625848bfaa38a86a0132a1771535fddb',1,'cv::cudev::operator||(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c08c399ce28a20e5849c10236e3ec1e',1,'cv::cudev::operator||(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga446ac73d6fc9c701bf235f9530e05486',1,'cv::cudev::operator||(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bdb1e714d4966bc3b89850c3f223aa6',1,'cv::cudev::operator||(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d607a72c6d5edbf0c5f0defadeecfe9',1,'cv::cudev::operator||(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc57b8d10acf24138375fc21e1799aeb',1,'cv::cudev::operator||(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b65fb035d930940ab0736ddbc0519fc',1,'cv::cudev::operator||(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1593e87e954982987925c25988dab81a',1,'cv::cudev::operator||(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0b4e24f07cae0bd5ef2032f1895b44',1,'cv::cudev::operator||(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb0588dab343533c00fe007f4e019f29',1,'cv::cudev::operator||(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7db7c5c12deeb79a3ad18e230fd0028',1,'cv::cudev::operator||(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99d4f17ca75885550288386f0959cfa5',1,'cv::cudev::operator||(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56bd222aa931f4a2f6c330e6e49ed71c',1,'cv::cudev::operator||(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53fea0cb9bdf3c6ad83ef37fe04f24dc',1,'cv::cudev::operator||(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c523f9819c7a99755990d8ed6b08504',1,'cv::cudev::operator||(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga093ad1e54e64a7cccf3782b2410172e3',1,'cv::cudev::operator||(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3bb180e11c140a1860d1c7282f3f4c5',1,'cv::cudev::operator||(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcd6bed19993a3dec96454714e056e3c',1,'cv::cudev::operator||(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8d59bf11b4243a05cd6cc3456fa3278',1,'cv::cudev::operator||(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga035765656c86485e88a7ffeedff10886',1,'cv::cudev::operator||(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c72b384daef54b49c99c95bb6e5d236',1,'cv::cudev::operator||(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac790b4177372769ebcb41bf113cc07d8',1,'cv::cudev::operator||(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444bdacd77a60792457a032271d6d8cc',1,'cv::cudev::operator||(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41de5b9e5a723be85cb439a1c08f7ce9',1,'cv::cudev::operator||(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5f81c65260b22ae9af48906f448382',1,'cv::cudev::operator||(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28d8dab796f6cc5d9efbba9a4a140d4',1,'cv::cudev::operator||(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32f816f6e9ef55e8af7d1076b934d769',1,'cv::cudev::operator||(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae58e21e5c4f719ccbeff08445d7c6fdc',1,'cv::cudev::operator||(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57922b91c42d3f3ec0d95961bb252c2a',1,'cv::cudev::operator||(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bd2ec7511fa65af12e0c31e7eca6cf1',1,'cv::cudev::operator||(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad435bf12fa84bd6238bd536719b8a55d',1,'cv::cudev::operator||(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace641577e19ea3b0204727ec67a54b77',1,'cv::cudev::operator||(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3ed13bdecfdf8509917b6128cbdd7b',1,'cv::cudev::operator||(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a42dd360c68ec429b3a9abd29792217',1,'cv::cudev::operator||(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62831716f60762daf6bdc34ba4563a5b',1,'cv::cudev::operator||(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eb7dc78006628d46caf362876324bfd',1,'cv::cudev::operator||(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95813948539b789f7529edc7fec1b313',1,'cv::cudev::operator||(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391980191d7c6907415884f3893e4622',1,'cv::cudev::operator||(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab52b978af7010683e959b7f5961f609c',1,'cv::cudev::operator||(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3c33ae535cb54e41e989a2e26834450',1,'cv::cudev::operator||(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed613e1f82f7862a55e3133e0b2ea94b',1,'cv::cudev::operator||(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c9970228fa884a956021c0cebfe15e5',1,'cv::cudev::operator||(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc178b7c15f18971eb20fffbb9a887a7',1,'cv::cudev::operator||(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d5361965c51f7ca2fe416200eb560d7',1,'cv::cudev::operator||(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487430a598578322fad0872d8e6ea35',1,'cv::cudev::operator||(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f85d3d5f36760dd63779885fef347fc',1,'cv::cudev::operator||(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0716b8368db9bfe6147ff620abcaf320',1,'cv::cudev::operator||(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3592b47fa7aa798a21f19a79a3a2d',1,'cv::cudev::operator||(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86fa4d24a51bc0fdb27624637e4162e7',1,'cv::cudev::operator||(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb7e65838ac0a9b1d7beac8bbf01b0e1',1,'cv::cudev::operator||(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9feff133da5c0cb798cc33b19fbd9ed2',1,'cv::cudev::operator||(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0995ff62918197fe40f2bea8e2b37898',1,'cv::cudev::operator||(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14791b0a2e98ba50d90b77b9d63768c3',1,'cv::cudev::operator||(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae3e389c0e99795f9a710bd9d7cd7893',1,'cv::cudev::operator||(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac554616aa3c8e0f521084e7fdffb3338',1,'cv::cudev::operator||(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e998efb0b51d4b11c8166bc17652e8f',1,'cv::cudev::operator||(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff58076f49066c7da5f88773b94eccca',1,'cv::cudev::operator||(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa98a4d1808e3e161362ed3709ac3b76f',1,'cv::cudev::operator||(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630796daa4fa81bd3480cccdd6208ce0',1,'cv::cudev::operator||(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1608d98a47346871d348ee3148a07c1a',1,'cv::cudev::operator||(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab756a072938395df21755c1b6a904d',1,'cv::cudev::operator||(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff73a5437bdeffdeb0b0c679cf39443b',1,'cv::cudev::operator||(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2b6b4c57ef47d6c51cc19656e57dc0',1,'cv::cudev::operator||(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ae692a8fbb489bb9e1745d7065fa41f',1,'cv::cudev::operator||(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee77151b150eacdfbd738bbd951de91',1,'cv::cudev::operator||(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7bb01e03b921b536c9de83900f120cb',1,'cv::cudev::operator||(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb998884b15432012259b70ee9eff749',1,'cv::cudev::operator||(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6139801e245820e8d980eb9fa19227ae',1,'cv::cudev::operator||(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba01bc6fa2a85a61bc572ee53396c0d',1,'cv::cudev::operator||(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8dc5f6ba926a32a8bb43a71f974f71f3',1,'cv::cudev::operator||(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5cd0e8199aa6ece5c42b6d469df866d',1,'cv::cudev::operator||(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3283fe040cbd0280fae5affaa5a577c3',1,'cv::cudev::operator||(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30c84efa97656970fb477d1ac42a077a',1,'cv::cudev::operator||(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae96a32168030467d5053c0f8bda7dd1b',1,'cv::cudev::operator||(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89385a5dbfdb1ef20b2e838ad9ec15cd',1,'cv::cudev::operator||(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fafcbb93a3a84b83a0d2d4e0609100d',1,'cv::cudev::operator||(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga848a2952f43a7226971f5d2426afbc8a',1,'cv::cudev::operator||(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf9201cd6a194985ee8dc16efad11954',1,'cv::cudev::operator||(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba6a7eed88b7ef37db22ace6732f6174',1,'cv::cudev::operator||(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44648e106e79365765d8081617546291',1,'cv::cudev::operator||(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a03a718dffc89a29648a361f61ba315',1,'cv::cudev::operator||(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade405ae7fba00188385f79da087b473d',1,'operator||(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67336d4da1a1a0e097576e110e322d17',1,'operator||(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d9325273f75ec46a5d0ccaa698dcab2',1,'operator||(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a350991d905802482a4a52516296256',1,'operator||(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd38e92dca97e14285cb0a994eac2eb2',1,'operator||(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1cf8719bfe35c1ce58b69439440ebb',1,'operator||(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga407966ca821a5b21a0fa3669273ce155',1,'operator||(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3f1b3a6297712114fb1528180bf4d5d',1,'operator||(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa60211ccc7148f580c9213f98d57d852',1,'operator||(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc492c09a30238356c29f992f434bbb',1,'operator||(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab229fbb04aea1adaf4ad5a99495035b9',1,'operator||(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac068c500d749dcf1c1b633a71343bf64',1,'operator||(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfceb475fab9bf020cc18a7d00ce68fa',1,'operator||(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga970bfbba082e36b082ec64f178fa4bc4',1,'operator||(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451cabb9165a8cb76c8b8281a48a74c3',1,'operator||(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ed51988f3b066b935628ca0ca76c806',1,'operator||(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56be341fd82bc471dc3727ac767df94d',1,'operator||(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43139046dc0327bc12a3405a63c93e78',1,'operator||(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga759c70e663c4ff4e8d2ae8217d47a7d7',1,'operator||(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64af392441e02098f668b91b581d6158',1,'operator||(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9dfe768a49878db05bdb91ebe5a8759b',1,'operator||(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga292fb2e70406a170f98347e3d2110db8',1,'operator||(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20d93bcf778f16d1853957cc42ff9eab',1,'operator||(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce18a713dc4adf2e6fc8841b69a7639',1,'operator||(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf45510b81f8e1759112cecd4b5a4aa3',1,'operator||(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fe1c8b48957c39413aac5e3ffd90376',1,'operator||(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b56bd1f805e2cc2a433d784ea26764b',1,'operator||(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51f6411482c1c1dc459307997d262caa',1,'operator||(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae01ca019d7b9f4b726b7017dccfb97eb',1,'operator||(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c9b224b12822bc42b33d5371cf7cef4',1,'operator||(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdb8f03f5e8aded2d1c1f5b674f8d0be',1,'operator||(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga682b9e8e6d24725fbfd14afe04c746cc',1,'operator||(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f2c04274bc2e9ef0c0e64e835272570',1,'operator||(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9613bf79ecb44e0124d987c0dc603c0e',1,'operator||(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96c371efcc9fa6314c3997cabac8de8e',1,'operator||(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebbcb4c326b4d6504cd9400ac933f53e',1,'operator||(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6a798890ec4e1c957610419cbc07fa3',1,'operator||(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0637cf031452de7f45462f4cf7d20f0',1,'operator||(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3532b09926ae239bbfdcb638f8602895',1,'operator||(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga625848bfaa38a86a0132a1771535fddb',1,'operator||(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c08c399ce28a20e5849c10236e3ec1e',1,'operator||(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga446ac73d6fc9c701bf235f9530e05486',1,'operator||(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bdb1e714d4966bc3b89850c3f223aa6',1,'operator||(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d607a72c6d5edbf0c5f0defadeecfe9',1,'operator||(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc57b8d10acf24138375fc21e1799aeb',1,'operator||(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b65fb035d930940ab0736ddbc0519fc',1,'operator||(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1593e87e954982987925c25988dab81a',1,'operator||(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0b4e24f07cae0bd5ef2032f1895b44',1,'operator||(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb0588dab343533c00fe007f4e019f29',1,'operator||(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7db7c5c12deeb79a3ad18e230fd0028',1,'operator||(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99d4f17ca75885550288386f0959cfa5',1,'operator||(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56bd222aa931f4a2f6c330e6e49ed71c',1,'operator||(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53fea0cb9bdf3c6ad83ef37fe04f24dc',1,'operator||(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c523f9819c7a99755990d8ed6b08504',1,'operator||(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga093ad1e54e64a7cccf3782b2410172e3',1,'operator||(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3bb180e11c140a1860d1c7282f3f4c5',1,'operator||(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcd6bed19993a3dec96454714e056e3c',1,'operator||(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8d59bf11b4243a05cd6cc3456fa3278',1,'operator||(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga035765656c86485e88a7ffeedff10886',1,'operator||(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c72b384daef54b49c99c95bb6e5d236',1,'operator||(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac790b4177372769ebcb41bf113cc07d8',1,'operator||(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444bdacd77a60792457a032271d6d8cc',1,'operator||(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41de5b9e5a723be85cb439a1c08f7ce9',1,'operator||(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5f81c65260b22ae9af48906f448382',1,'operator||(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28d8dab796f6cc5d9efbba9a4a140d4',1,'operator||(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32f816f6e9ef55e8af7d1076b934d769',1,'operator||(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae58e21e5c4f719ccbeff08445d7c6fdc',1,'operator||(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57922b91c42d3f3ec0d95961bb252c2a',1,'operator||(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bd2ec7511fa65af12e0c31e7eca6cf1',1,'operator||(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad435bf12fa84bd6238bd536719b8a55d',1,'operator||(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace641577e19ea3b0204727ec67a54b77',1,'operator||(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3ed13bdecfdf8509917b6128cbdd7b',1,'operator||(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a42dd360c68ec429b3a9abd29792217',1,'operator||(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62831716f60762daf6bdc34ba4563a5b',1,'operator||(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eb7dc78006628d46caf362876324bfd',1,'operator||(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95813948539b789f7529edc7fec1b313',1,'operator||(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391980191d7c6907415884f3893e4622',1,'operator||(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab52b978af7010683e959b7f5961f609c',1,'operator||(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3c33ae535cb54e41e989a2e26834450',1,'operator||(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed613e1f82f7862a55e3133e0b2ea94b',1,'operator||(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c9970228fa884a956021c0cebfe15e5',1,'operator||(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc178b7c15f18971eb20fffbb9a887a7',1,'operator||(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d5361965c51f7ca2fe416200eb560d7',1,'operator||(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487430a598578322fad0872d8e6ea35',1,'operator||(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f85d3d5f36760dd63779885fef347fc',1,'operator||(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0716b8368db9bfe6147ff620abcaf320',1,'operator||(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3592b47fa7aa798a21f19a79a3a2d',1,'operator||(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86fa4d24a51bc0fdb27624637e4162e7',1,'operator||(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb7e65838ac0a9b1d7beac8bbf01b0e1',1,'operator||(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9feff133da5c0cb798cc33b19fbd9ed2',1,'operator||(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0995ff62918197fe40f2bea8e2b37898',1,'operator||(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14791b0a2e98ba50d90b77b9d63768c3',1,'operator||(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae3e389c0e99795f9a710bd9d7cd7893',1,'operator||(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac554616aa3c8e0f521084e7fdffb3338',1,'operator||(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e998efb0b51d4b11c8166bc17652e8f',1,'operator||(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff58076f49066c7da5f88773b94eccca',1,'operator||(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa98a4d1808e3e161362ed3709ac3b76f',1,'operator||(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630796daa4fa81bd3480cccdd6208ce0',1,'operator||(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1608d98a47346871d348ee3148a07c1a',1,'operator||(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab756a072938395df21755c1b6a904d',1,'operator||(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff73a5437bdeffdeb0b0c679cf39443b',1,'operator||(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2b6b4c57ef47d6c51cc19656e57dc0',1,'operator||(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ae692a8fbb489bb9e1745d7065fa41f',1,'operator||(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee77151b150eacdfbd738bbd951de91',1,'operator||(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7bb01e03b921b536c9de83900f120cb',1,'operator||(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb998884b15432012259b70ee9eff749',1,'operator||(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6139801e245820e8d980eb9fa19227ae',1,'operator||(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba01bc6fa2a85a61bc572ee53396c0d',1,'operator||(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8dc5f6ba926a32a8bb43a71f974f71f3',1,'operator||(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5cd0e8199aa6ece5c42b6d469df866d',1,'operator||(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3283fe040cbd0280fae5affaa5a577c3',1,'operator||(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30c84efa97656970fb477d1ac42a077a',1,'operator||(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae96a32168030467d5053c0f8bda7dd1b',1,'operator||(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89385a5dbfdb1ef20b2e838ad9ec15cd',1,'operator||(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fafcbb93a3a84b83a0d2d4e0609100d',1,'operator||(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga848a2952f43a7226971f5d2426afbc8a',1,'operator||(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf9201cd6a194985ee8dc16efad11954',1,'operator||(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba6a7eed88b7ef37db22ace6732f6174',1,'operator||(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44648e106e79365765d8081617546291',1,'operator||(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a03a718dffc89a29648a361f61ba315',1,'operator||(const double2 &a, double s)(Global Namespace)']]], + ['operator_7e_343',['operator~',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69ba8f5d451de974d9aa514cdbbb1120',1,'cv::MatExpr::operator~(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69ba8f5d451de974d9aa514cdbbb1120',1,'cv::MatExpr::operator~(const Mat &m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a2cdeed3169c5dbfd617f68bbef6457ee',1,'std::bitset::operator~()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aed8f061579e182d2d8249f37a11de6c4',1,'std::tr2::dynamic_bitset::operator~()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga88b2ec0fbd1864a99c09d24f5b39e16d',1,'std::valarray::operator~()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga88b2ec0fbd1864a99c09d24f5b39e16d',1,'valarray< size_t >::operator~()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6238e30480f4a52f3b30d5c21bbbadb1',1,'cv::operator~()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf198524c2b506a2c29566cf7c9ae5e19',1,'cv::cudev::operator~(const Expr< Body > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf5b7bc46f1c4ffac38c938fdbea0d16',1,'cv::cudev::operator~(const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4618266096d4f1e47a4cd6967fb84fc3',1,'cv::cudev::operator~(const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8deb59fd638ca954bbdaf55f76a897',1,'cv::cudev::operator~(const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3055d07443d2275c1d12b97bdf297fce',1,'cv::cudev::operator~(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c754a9105964639a463dadebfa4176',1,'cv::cudev::operator~(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d4f587e0787e85c7237f061c7f5629',1,'cv::cudev::operator~(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77e7214b716a6e24b6c0ad5100723acb',1,'cv::cudev::operator~(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa20f0d48b258a29f1f78dc3bcd155f2',1,'cv::cudev::operator~(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bb7b251d40b57f97ee8761816827d5f',1,'cv::cudev::operator~(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cca9e55f0124be8c28f031dde68ff82',1,'cv::cudev::operator~(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga838e1acadd4adf72d05375901877406a',1,'cv::cudev::operator~(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8c1a39515d09b32e3d25441c5cd129a',1,'cv::cudev::operator~(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf372f82a0e3f18ff74490509c8fb3600',1,'cv::cudev::operator~(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga077d19d04f77129e7fdb284d42bc78ee',1,'cv::cudev::operator~(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa789cd510fcff4984885dcdfbb618018',1,'cv::cudev::operator~(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7d9565b8e27201dbcefa113a9c16c8',1,'cv::cudev::operator~(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga861b8704201b4e6e2d55a9abd798161a',1,'cv::cudev::operator~(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195352c298ca60f9f1427d993b5aeb6c',1,'cv::cudev::operator~(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa4e3b79d78611d2031c8d21420d4ab',1,'cv::cudev::operator~(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133c3fb71ea8172a37867390be557400',1,'cv::cudev::operator~(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7d6682dd37b7ea68625ab7a1b693926',1,'cv::cudev::operator~(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9cb1d6029d987bdbd57fb47193ee591',1,'cv::cudev::operator~(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1e50a02cb728d3a0a936c6239263d0',1,'cv::cudev::operator~(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79cc15f84516fa21851f6c9748497891',1,'cv::cudev::operator~(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37a2be39fcfb682e1e91697df152cdd3',1,'cv::cudev::operator~(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8e1f246e66d56a7a4315f926d64938e',1,'cv::cudev::operator~(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecbd81337a2a8039c93dc0f6b7f322d4',1,'cv::cudev::operator~(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6238e30480f4a52f3b30d5c21bbbadb1',1,'operator~(const v_reg< _Tp, n > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf198524c2b506a2c29566cf7c9ae5e19',1,'operator~(const Expr< Body > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf5b7bc46f1c4ffac38c938fdbea0d16',1,'operator~(const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4618266096d4f1e47a4cd6967fb84fc3',1,'operator~(const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8deb59fd638ca954bbdaf55f76a897',1,'operator~(const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3055d07443d2275c1d12b97bdf297fce',1,'operator~(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c754a9105964639a463dadebfa4176',1,'operator~(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d4f587e0787e85c7237f061c7f5629',1,'operator~(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77e7214b716a6e24b6c0ad5100723acb',1,'operator~(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa20f0d48b258a29f1f78dc3bcd155f2',1,'operator~(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bb7b251d40b57f97ee8761816827d5f',1,'operator~(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cca9e55f0124be8c28f031dde68ff82',1,'operator~(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga838e1acadd4adf72d05375901877406a',1,'operator~(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8c1a39515d09b32e3d25441c5cd129a',1,'operator~(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf372f82a0e3f18ff74490509c8fb3600',1,'operator~(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga077d19d04f77129e7fdb284d42bc78ee',1,'operator~(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa789cd510fcff4984885dcdfbb618018',1,'operator~(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7d9565b8e27201dbcefa113a9c16c8',1,'operator~(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga861b8704201b4e6e2d55a9abd798161a',1,'operator~(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195352c298ca60f9f1427d993b5aeb6c',1,'operator~(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa4e3b79d78611d2031c8d21420d4ab',1,'operator~(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133c3fb71ea8172a37867390be557400',1,'operator~(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7d6682dd37b7ea68625ab7a1b693926',1,'operator~(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9cb1d6029d987bdbd57fb47193ee591',1,'operator~(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1e50a02cb728d3a0a936c6239263d0',1,'operator~(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79cc15f84516fa21851f6c9748497891',1,'operator~(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37a2be39fcfb682e1e91697df152cdd3',1,'operator~(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8e1f246e66d56a7a4315f926d64938e',1,'operator~(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecbd81337a2a8039c93dc0f6b7f322d4',1,'operator~(const uint1 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ad3de70b7c5c74267276903c86628e239',1,'std::regex_constants::operator~(syntax_option_type __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a2aeb16521b6691e19cb344505b084271',1,'std::regex_constants::operator~(match_flag_type __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga88b2ec0fbd1864a99c09d24f5b39e16d',1,'operator~()(Global Namespace)']]], + ['oplandiplparvo_344',['OPLandIplParvo',['https://docs.opencv.org/4.2.0/d2/df5/structcv_1_1bioinspired_1_1RetinaParameters.html#a22079e2a0666d7f0add1e8bb2cd63500',1,'cv::bioinspired::RetinaParameters']]], + ['oplandiplparvoparameters_345',['OPLandIplParvoParameters',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters'],['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#a397e52e1f6738f907169910800c6aae7',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters::OPLandIplParvoParameters()']]], + ['opt_5frandom_2eh_346',['opt_random.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00713.html',1,'']]], + ['optflow_2ehpp_347',['optflow.hpp',['https://docs.opencv.org/4.2.0/de/d67/optflow_8hpp.html',1,'']]], + ['optflow_5ffarneback_5fgaussian_348',['OPTFLOW_FARNEBACK_GAUSSIAN',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a4ffe37adbc548e44a61025a26a1914aa',1,'cv::OPTFLOW_FARNEBACK_GAUSSIAN'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a4ffe37adbc548e44a61025a26a1914aa',1,'OPTFLOW_FARNEBACK_GAUSSIAN(Global Namespace)']]], + ['optflow_5flk_5fget_5fmin_5feigenvals_349',['OPTFLOW_LK_GET_MIN_EIGENVALS',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08add75f0bd85d1bd739b39b8900bc12c58',1,'cv::OPTFLOW_LK_GET_MIN_EIGENVALS'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08add75f0bd85d1bd739b39b8900bc12c58',1,'OPTFLOW_LK_GET_MIN_EIGENVALS(Global Namespace)']]], + ['optflow_5fuse_5finitial_5fflow_350',['OPTFLOW_USE_INITIAL_FLOW',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a9d4430ac75199af0cf6fcdefba30eafe',1,'cv::OPTFLOW_USE_INITIAL_FLOW'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a9d4430ac75199af0cf6fcdefba30eafe',1,'OPTFLOW_USE_INITIAL_FLOW(Global Namespace)']]], + ['optflowestimator_351',['optFlowEstimator',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#a2febcdca26690c112002949348ade823',1,'cv::videostab::MotionInpainter']]], + ['optical_20flow_352',['Optical Flow',['https://docs.opencv.org/4.2.0/d7/d3f/group__cudaoptflow.html',1,'Optical Flow'],['https://docs.opencv.org/4.2.0/d4/dee/tutorial_optical_flow.html',1,'Optical Flow'],['https://docs.opencv.org/4.2.0/d7/d8b/tutorial_py_lucas_kanade.html',1,'Optical Flow'],['https://docs.opencv.org/4.2.0/db/d7f/tutorial_js_lucas_kanade.html',1,'Optical Flow']]], + ['optical_20flow_20algorithms_353',['Optical Flow Algorithms',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html',1,'']]], + ['optical_20illusions_354',['Processing images causing optical illusions',['https://docs.opencv.org/4.2.0/d7/d8f/tutorial_bioinspired_retina_illusion.html',1,'']]], + ['optical_5fflow_2ehpp_355',['optical_flow.hpp',['https://docs.opencv.org/4.2.0/d2/dc3/superres_2include_2opencv2_2superres_2optical__flow_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d49/videostab_2include_2opencv2_2videostab_2optical__flow_8hpp.html',1,'(Global Namespace)']]], + ['optical_5fflow_2emarkdown_356',['optical_flow.markdown',['https://docs.opencv.org/4.2.0/db/d50/optical__flow_8markdown.html',1,'']]], + ['opticalflowdual_5ftvl1_357',['OpticalFlowDual_TVL1',['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html',1,'cv::cuda']]], + ['opticalflowestimator_358',['opticalFlowEstimator',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a490cd8c016f7b4d181daedb55eec28e9',1,'cv::videostab::KeypointBasedMotionEstimator']]], + ['opticalflowpcaflow_359',['OpticalFlowPCAFlow',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html',1,'cv::optflow::OpticalFlowPCAFlow'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#afe6dd4b33d08e519a8ef2d0798564040',1,'cv::optflow::OpticalFlowPCAFlow::OpticalFlowPCAFlow()']]], + ['optim_2ehpp_360',['optim.hpp',['https://docs.opencv.org/4.2.0/d3/d46/optim_8hpp.html',1,'']]], + ['optimization_20algorithms_361',['Optimization Algorithms',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html',1,'']]], + ['optimize_362',['optimize',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a77f83de09c72048a75a66344f0bfb2f3',1,'std::regex_constants']]], + ['optimizeextrinsics_363',['optimizeExtrinsics',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#ac4c4d52808b8878e134c22c09e0b5717',1,'cv::multicalib::MultiCameraCalibration']]], + ['optional_364',['optional',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html',1,'cv::util::optional< T >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10071.html',1,'std::experimental::fundamentals_v1::optional< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01016.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#ab22465abe81369037764c6ac1b799273',1,'cv::util::optional::optional()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a09eaedc3d5761ccc237a213e6f4f8d94',1,'cv::util::optional::optional(const optional &)=default'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#aad5e2bf28fd67eac2c683e189d25f9e0',1,'cv::util::optional::optional(T &&value) noexcept'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a63127f3a74565eec28548a24e18c2716',1,'cv::util::optional::optional(const T &value) noexcept'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#ab7e3745f571967e65d36bc7eeb640d7f',1,'cv::util::optional::optional(optional &&) noexcept']]], + ['optional_20values_365',['Optional values',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html',1,'']]], + ['optional_2ehpp_366',['optional.hpp',['https://docs.opencv.org/4.2.0/db/dd5/optional_8hpp.html',1,'']]], + ['optional_5flock_5fguard_367',['optional_lock_guard',['https://docs.opencv.org/4.2.0/d3/de8/classcv_1_1utils_1_1optional__lock__guard.html',1,'cv::utils::optional_lock_guard< class >'],['https://docs.opencv.org/4.2.0/d3/de8/classcv_1_1utils_1_1optional__lock__guard.html#a8a7a28c1f9a4153a89b806ce065106e1',1,'cv::utils::optional_lock_guard::optional_lock_guard()']]], + ['optional_5fshared_5flock_5fguard_368',['optional_shared_lock_guard',['https://docs.opencv.org/4.2.0/d2/ddd/classcv_1_1utils_1_1optional__shared__lock__guard.html',1,'cv::utils::optional_shared_lock_guard< class >'],['https://docs.opencv.org/4.2.0/d2/ddd/classcv_1_1utils_1_1optional__shared__lock__guard.html#a87856795a393a792d0588da931a6f6d6',1,'cv::utils::optional_shared_lock_guard::optional_shared_lock_guard()']]], + ['options_369',['options',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a42d9d79073379f1e75b0f2c49879ed5b',1,'Eigen::SuperLUBase::options()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a42d9d79073379f1e75b0f2c49879ed5b',1,'SuperLUBase< _MatrixType, SuperILU< _MatrixType > >::options()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a42d9d79073379f1e75b0f2c49879ed5b',1,'SuperLUBase< _MatrixType, SuperLU< _MatrixType > >::options()']]], + ['or_20maximum_370',['Element-wise minimum or maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'']]], + ['or_20miss_371',['Hit-or-Miss',['https://docs.opencv.org/4.2.0/db/d06/tutorial_hitOrMiss.html',1,'']]], + ['or8u_372',['or8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabe8e8d763760f73eb41f9b555b92a6a3',1,'cv::hal::or8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabe8e8d763760f73eb41f9b555b92a6a3',1,'or8u()(Global Namespace)']]], + ['or_5fimagenet_373',['OR_imagenet',['https://docs.opencv.org/4.2.0/db/df7/classcv_1_1datasets_1_1OR__imagenet.html',1,'cv::datasets']]], + ['or_5fimagenet_2ehpp_374',['or_imagenet.hpp',['https://docs.opencv.org/4.2.0/d2/d38/or__imagenet_8hpp.html',1,'']]], + ['or_5fimagenetobj_375',['OR_imagenetObj',['https://docs.opencv.org/4.2.0/de/d3f/structcv_1_1datasets_1_1OR__imagenetObj.html',1,'cv::datasets']]], + ['or_5fmnist_376',['OR_mnist',['https://docs.opencv.org/4.2.0/d9/d92/classcv_1_1datasets_1_1OR__mnist.html',1,'cv::datasets']]], + ['or_5fmnist_2ehpp_377',['or_mnist.hpp',['https://docs.opencv.org/4.2.0/dc/d44/or__mnist_8hpp.html',1,'']]], + ['or_5fmnistobj_378',['OR_mnistObj',['https://docs.opencv.org/4.2.0/d0/d2c/structcv_1_1datasets_1_1OR__mnistObj.html',1,'cv::datasets']]], + ['or_5fpascal_379',['OR_pascal',['https://docs.opencv.org/4.2.0/d4/d7e/classcv_1_1datasets_1_1OR__pascal.html',1,'cv::datasets']]], + ['or_5fpascal_2ehpp_380',['or_pascal.hpp',['https://docs.opencv.org/4.2.0/d0/d57/or__pascal_8hpp.html',1,'']]], + ['or_5fpascalobj_381',['OR_pascalObj',['https://docs.opencv.org/4.2.0/d0/db6/structcv_1_1datasets_1_1OR__pascalObj.html',1,'cv::datasets']]], + ['or_5fsun_382',['OR_sun',['https://docs.opencv.org/4.2.0/da/d69/classcv_1_1datasets_1_1OR__sun.html',1,'cv::datasets']]], + ['or_5fsun_2ehpp_383',['or_sun.hpp',['https://docs.opencv.org/4.2.0/d4/dc0/or__sun_8hpp.html',1,'']]], + ['or_5fsunobj_384',['OR_sunObj',['https://docs.opencv.org/4.2.0/d8/d74/structcv_1_1datasets_1_1OR__sunObj.html',1,'cv::datasets']]], + ['orange_385',['orange',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1a1069a4fd84db013399ffc68c202901',1,'cv::viz::Color']]], + ['orange_5fred_386',['orange_red',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a6d78c79310b79a16fd8100b80d50aeef',1,'cv::viz::Color']]], + ['orb_387',['ORB',['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html',1,'cv::cuda::ORB'],['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html',1,'cv::ORB']]], + ['orb_20oriented_20fast_20and_20rotated_20brief_388',['ORB (Oriented FAST and Rotated BRIEF)',['https://docs.opencv.org/4.2.0/d1/d89/tutorial_py_orb.html',1,'']]], + ['orb_20planar_20tracking_389',['AKAZE and ORB planar tracking',['https://docs.opencv.org/4.2.0/dc/d16/tutorial_akaze_tracking.html',1,'']]], + ['order_5fof_5fkey_390',['order_of_key',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#a1c33a80afedc268c76b5ad8468fb84ee',1,'__gnu_pbds::tree_order_statistics_node_update::order_of_key()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#afc18e57812078123f3fb91a1148ec5f5',1,'__gnu_pbds::trie_order_statistics_node_update::order_of_key(key_const_reference) const']]], + ['order_5fof_5fprefix_391',['order_of_prefix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#a5baafac1f227b055faf0f836ccf166fc',1,'__gnu_pbds::trie_order_statistics_node_update']]], + ['order_5fpreserving_392',['order_preserving',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html#ace925c8be06b3640abb7b6f486290daba7a8084f7409a761ceaa0de948e82363d',1,'__gnu_pbds::container_traits']]], + ['ordered_5fbase_2eh_393',['ordered_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00818.html',1,'']]], + ['ordered_5fjson_394',['ordered_json',['https://nlohmann.github.io/json/doxygen/namespacenlohmann_ad53cef358adfa7f07cea23eb1e28b9ea.html#ad53cef358adfa7f07cea23eb1e28b9ea',1,'nlohmann']]], + ['ordered_5fmap_395',['ordered_map',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map.html',1,'nlohmann::ordered_map< class, class, class, class >'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a87938c10b76510dac00412d2cb5fd1e4.html#a87938c10b76510dac00412d2cb5fd1e4',1,'nlohmann::ordered_map::ordered_map(const Allocator &alloc=Allocator())'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a9d25efb51325cc1be027b8ea00c1f8b8.html#a9d25efb51325cc1be027b8ea00c1f8b8',1,'nlohmann::ordered_map::ordered_map(It first, It last, const Allocator &alloc=Allocator())'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a0482ea79e7786367a2d9b5c789c091ce.html#a0482ea79e7786367a2d9b5c789c091ce',1,'nlohmann::ordered_map::ordered_map(std::initializer_list< T > init, const Allocator &alloc=Allocator())']]], + ['orderingmethods_20module_396',['OrderingMethods module',['https://eigen.tuxfamily.org/dox/group__OrderingMethods__Module.html',1,'']]], + ['orders_397',['Storage orders',['https://eigen.tuxfamily.org/dox/group__TopicStorageOrders.html',1,'']]], + ['org_398',['org',['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#af578c3e129f7a24b1c0d5513f46c7809',1,'cv::gapi::wip::draw::FText::org'],['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html#a015abca43b85577f24c46b9b72ce2e45',1,'cv::gapi::wip::draw::Image::org'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a8af3274325bafac592a8b5df6d49921b',1,'cv::gapi::wip::draw::Text::org']]], + ['oriented_20fast_20and_20rotated_20brief_399',['ORB (Oriented FAST and Rotated BRIEF)',['https://docs.opencv.org/4.2.0/d1/d89/tutorial_py_orb.html',1,'']]], + ['orig_5fresol_400',['ORIG_RESOL',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#af864448487371edc19bc3034ab2479b6',1,'cv::Stitcher']]], + ['origdata_401',['origdata',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#aee30a2d2615e8e4d7fcfb2c893ac9839',1,'cv::UMatData']]], + ['original_5fdata_402',['original_data',['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a6cde45f9caf9abd917d203459c7adfcb',1,'cv::detail::tracked_cv_mat::original_data'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a8239876c6987cec486138493596be8b7',1,'cv::detail::tracked_cv_umat::original_data']]], + ['original_5fimage_403',['original_image',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#af6dbad308d1f29c33cdefd2cef98c31d',1,'cv::datasets::FR_adienceObj']]], + ['originalumatdata_404',['originalUMatData',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4bdd72ed97e5afd923d661cd6e6f6471',1,'cv::UMatData']]], + ['os_5fdefines_2eh_405',['os_defines.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00716.html',1,'']]], + ['ostream_406',['ostream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00116.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga55d4c0674fbacb7514ae76310aeb4bf8',1,'std::ostream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga55d4c0674fbacb7514ae76310aeb4bf8',1,'ostream(Global Namespace)']]], + ['ostream_2etcc_407',['ostream.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00434.html',1,'']]], + ['ostream_5finsert_2eh_408',['ostream_insert.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00437.html',1,'']]], + ['ostream_5fiterator_409',['ostream_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html',1,'std::ostream_iterator< class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a43b5a82905d5237921fc78c44455950a',1,'std::ostream_iterator::ostream_iterator(ostream_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#afa776b7965fc2d27f9281944542be2d8',1,'std::ostream_iterator::ostream_iterator(ostream_type &__s, const _CharT *__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a6f93dbe2e9972260dd0ab4b869967e26',1,'std::ostream_iterator::ostream_iterator(const ostream_iterator &__obj)']]], + ['ostream_5fjoiner_410',['ostream_joiner',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10023.html',1,'std::experimental::fundamentals_v2']]], + ['ostream_5ftype_411',['ostream_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#aa8e002bf7b5552b4b9117198b99050ab',1,'std::ostream_iterator::ostream_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#aa8e002bf7b5552b4b9117198b99050ab',1,'std::ostream_iterator::ostream_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ab1268dc45f0682f612da8e1c6fd7b0ac',1,'std::ostreambuf_iterator::ostream_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ab1268dc45f0682f612da8e1c6fd7b0ac',1,'std::ostreambuf_iterator::ostream_type']]], + ['ostreambuf_5fiterator_412',['ostreambuf_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html',1,'std::ostreambuf_iterator< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ac9080f23edb16ede8dc2e24e84f75207',1,'std::ostreambuf_iterator::ostreambuf_iterator(ostream_type &__s) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#aef4876e87478fee9493302260f2c1b36',1,'std::ostreambuf_iterator::ostreambuf_iterator(streambuf_type *__s) noexcept']]], + ['ostringstream_413',['ostringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gac2ba708c34afa6e120c07e56bfce9cd3',1,'std::ostringstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gac2ba708c34afa6e120c07e56bfce9cd3',1,'ostringstream(Global Namespace)']]], + ['other_414',['other',['https://docs.opencv.org/4.2.0/d1/d1d/structcv_1_1cudev_1_1Sum_1_1rebind.html#aaae743f5deb12eaeced97003dc51616c',1,'cv::cudev::Sum::rebind::other'],['https://docs.opencv.org/4.2.0/d3/dd1/structcv_1_1cudev_1_1Avg_1_1rebind.html#a30a46b30d73c26c6ad3786ef2ad8f3df',1,'cv::cudev::Avg::rebind::other'],['https://docs.opencv.org/4.2.0/d2/dff/structcv_1_1cudev_1_1Min_1_1rebind.html#acfe7a9701bc3ba064c760d28f8947775',1,'cv::cudev::Min::rebind::other'],['https://docs.opencv.org/4.2.0/d1/d7c/structcv_1_1cudev_1_1Max_1_1rebind.html#a2baa5b57935c857e51bd95ff22e667f6',1,'cv::cudev::Max::rebind::other']]], + ['other_20classes_415',['Extending MatrixBase (and other classes)',['https://eigen.tuxfamily.org/dox/TopicCustomizing_Plugins.html',1,'']]], + ['other_20doxygen_20projects_416',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], + ['other_20intel_20perceptual_20computing_20sdk_20compatible_20depth_20sensors_417',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], + ['other_20openni_20compatible_20depth_20sensors_418',['Using Kinect and other OpenNI compatible depth sensors',['https://docs.opencv.org/4.2.0/d7/d6f/tutorial_kinect_openni.html',1,'']]], + ['other_5ferror_419',['other_error',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6fc373c99facc37aadbc5651b3d6631d.html#a6fc373c99facc37aadbc5651b3d6631d',1,'nlohmann::basic_json']]], + ['others_5fall_420',['others_all',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a5bea7ea33126a22add82c5809bfa6366',1,'others_all(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a5bea7ea33126a22add82c5809bfa6366',1,'others_all(Global Namespace)']]], + ['others_5fexec_421',['others_exec',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a5a2e0fba544a04c9e3f47dc370c28bf2',1,'others_exec(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a5a2e0fba544a04c9e3f47dc370c28bf2',1,'others_exec(Global Namespace)']]], + ['others_5fread_422',['others_read',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145ae1ea303787306dda3e50a432832c998a',1,'others_read(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145ae1ea303787306dda3e50a432832c998a',1,'others_read(Global Namespace)']]], + ['others_5fwrite_423',['others_write',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145af9d2b2426ee261e7ab294f317c5115bf',1,'others_write(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145af9d2b2426ee261e7ab294f317c5115bf',1,'others_write(Global Namespace)']]], + ['our_20applications_424',['Adding a Trackbar to our applications!',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'']]], + ['out_425',['Out',['https://docs.opencv.org/4.2.0/dd/d98/structcv_1_1gapi_1_1ie_1_1PortCfg.html#a73601a4545cc2eea31511e6067010523',1,'cv::gapi::ie::PortCfg']]], + ['out_426',['out',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_ios< char, _Traits >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_iostream< char >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_istream< char >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_istream< char, _Traits >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_ostream< char >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_ostream< char, _Traits >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_fstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ifstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ios::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_iostream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_istream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_istringstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ofstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ostream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ostringstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_stringstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::ios_base::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< _InternT, _ExternT, encoding_state >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< char, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< char16_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< char32_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< wchar_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'codecvt< _Elem, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::__codecvt_abstract_base::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< _InternT, _ExternT, encoding_state >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< char, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< char16_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< char32_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< wchar_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt_byname::out()']]], + ['out_20of_20focus_20deblur_20filter_427',['Out-of-focus Deblur Filter',['https://docs.opencv.org/4.2.0/de/d3c/tutorial_out_of_focus_deblur_filter.html',1,'']]], + ['out_5fof_5ffocus_5fdeblur_5ffilter_2emarkdown_428',['out_of_focus_deblur_filter.markdown',['https://docs.opencv.org/4.2.0/d4/d4d/out__of__focus__deblur__filter_8markdown.html',1,'']]], + ['out_5fof_5frange_429',['out_of_range',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02807.html',1,'std::out_of_range'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a2251d8523fa6d16c0fba6388ffa2ef8c.html#a2251d8523fa6d16c0fba6388ffa2ef8c',1,'nlohmann::basic_json::out_of_range']]], + ['out_5ftag_430',['Out_Tag',['https://docs.opencv.org/4.2.0/dd/d92/structcv_1_1Out__Tag.html',1,'cv']]], + ['outargs_431',['OutArgs',['https://docs.opencv.org/4.2.0/df/d7c/classcv_1_1GKernelType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a4d3d93d4cceda20b6712ca4b0a21ceaa',1,'cv::GKernelType< K, std::function< R(Args...)> >::OutArgs'],['https://docs.opencv.org/4.2.0/dc/d2d/classcv_1_1GKernelTypeM_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a5d425af9fdadd9e84aa9ae9da620fb54',1,'cv::GKernelTypeM< K, std::function< std::tuple< R... >(Args...)> >::OutArgs'],['https://docs.opencv.org/4.2.0/dc/de8/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a3e36c5b5f896a8c38ca9ec9214cb42e8',1,'cv::GNetworkType< K, std::function< R(Args...)> >::OutArgs'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a36e3cb62226e67796bf747908a4eacf2',1,'cv::GNetworkType< K, std::function< std::tuple< R... >(Args...)> >::OutArgs']]], + ['outer_432',['outer',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Eigen::Stride::outer()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Stride< 0, Value >::outer()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::outer()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Stride< Value, 0 >::outer()']]], + ['outerindexptr_433',['outerIndexPtr',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'Eigen::SparseCompressedBase::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'Eigen::SparseCompressedBase::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Derived >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Derived >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Transpose< MatrixType > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Transpose< MatrixType > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a24c55dd8de4aca30e7c90b69aa5dca6b',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html#a3b74af754254837fc591cd9936688b95',1,'Eigen::SparseMapBase< Derived, WriteAccessors >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'Eigen::SparseMatrix::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'Eigen::SparseMatrix::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar, ColMajor, int >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar, ColMajor, int >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::outerIndexPtr() const']]], + ['outersize_434',['outerSize',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'Eigen::DenseBase::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'DenseBase< ArrayWrapper< ExpressionType > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'DenseBase< Solve< Decomposition, RhsType > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a3d6ede19db6d42074ae063bc876231b1',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'Eigen::SparseMatrix::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar, ColMajor, int >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'Eigen::SparseMatrixBase::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< Transpose< MatrixType > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::outerSize()']]], + ['outerstride_435',['OuterStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1OuterStride.html',1,'Eigen']]], + ['outerstride_436',['outerStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#ad88c60c4a2356be2c436f3264dd20b55',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::outerStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#abb333f6f10467f6f8d7b59c213dea49e',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::outerStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#afe47788156e483b9025ab320cc7f925e',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::outerStride()']]], + ['outlier_5frejection_2ehpp_437',['outlier_rejection.hpp',['https://docs.opencv.org/4.2.0/da/d94/outlier__rejection_8hpp.html',1,'']]], + ['outlierrejector_438',['outlierRejector',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a1c7ec46d4913af1d422b6accb67ddfed',1,'cv::videostab::KeypointBasedMotionEstimator']]], + ['outline_439',['OutLine',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a436e4b941c3da68fae821ed5786620b3',1,'cv::gapi::fluid::Buffer']]], + ['outlineb_440',['OutLineB',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a875c6cfa0315fbb9e1aa94153d7af378',1,'cv::gapi::fluid::Buffer']]], + ['outmatr_441',['outMatR',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#a271dfd3a4a49c4900165991414fc5342',1,'cv::GCPUContext::outMatR()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#ab6561a2ea00141e38ac8afa1f89458ab',1,'cv::GOCLContext::outMatR()']]], + ['outmeta_442',['outMeta',['https://docs.opencv.org/4.2.0/db/d4d/structcv_1_1GKernel.html#a323e65c28a1d3127987f7946a7b1e6c7',1,'cv::GKernel']]], + ['outmetas_443',['outMetas',['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#adb1e2c45cc469afe7aa98d5500aac1a4',1,'cv::GCompiled::outMetas()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ac9961bb29f6e049fcda55384877b8bb5',1,'cv::GStreamingCompiled::outMetas()']]], + ['output_444',['Output',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html',1,'Input/Output'],['../classfilters_1_1Output.html',1,'filters::Output'],['../classfilters_1_1Output.html#a48acc7be07c07f2336679a1d81a1f0e4',1,'filters::Output::Output()']]], + ['output_445',['output',['https://docs.opencv.org/4.2.0/d6/dca/tutorial_dnn_superres_upscale_image_multi.html',1,'Upscaling images: multi-output'],['https://docs.opencv.org/4.2.0/d5/d29/tutorial_dnn_superres_upscale_image_single.html',1,'Upscaling images: single-output']]], + ['output_20imgcodecs_20module_446',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], + ['output_20using_20xml_20and_20yaml_20files_447',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], + ['output_20videoio_20module_448',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], + ['output_5fiterator_5ftag_449',['output_iterator_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07695.html',1,'std']]], + ['output_5fnames_450',['output_names',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#aa8858a371b710e686b4df176c3ccd946',1,'cv::gapi::ie::detail::ParamDesc']]], + ['output_5fsigma_5ffactor_451',['output_sigma_factor',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a607c4d0a852b08b030b15751d0574eb0',1,'cv::TrackerKCF::Params']]], + ['outputarray_452',['OutputArray',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaad17fda1d0f0d1ee069aebb1df2913c0',1,'cv::OutputArray'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaad17fda1d0f0d1ee069aebb1df2913c0',1,'OutputArray(Global Namespace)']]], + ['outputarrayofarrays_453',['OutputArrayOfArrays',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga889a09549b98223016170d9b613715de',1,'cv::OutputArrayOfArrays'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga889a09549b98223016170d9b613715de',1,'OutputArrayOfArrays(Global Namespace)']]], + ['outputfuncjacobianv_454',['outputFuncJacobianV',['../classfilters_1_1ExtendedKalmanFilter.html#a5d6049b785a75a625ce056d6af72de09',1,'filters::ExtendedKalmanFilter::outputFuncJacobianV'],['../classfilters_1_1Output.html#ad993de846ff252efb8bb22c99805b508',1,'filters::Output::outputFuncJacobianV()']]], + ['outputfuncjacobianx_455',['outputFuncJacobianX',['../classfilters_1_1ExtendedKalmanFilter.html#a5e826cf699de91cc9a030128b484d629',1,'filters::ExtendedKalmanFilter::outputFuncJacobianX'],['../classfilters_1_1Output.html#a5c42af319c18c623e92f92a70b3d0580',1,'filters::Output::outputFuncJacobianX()']]], + ['outputnametoindex_456',['outputNameToIndex',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a60ffc8238f3fa26cd3f49daa7ac0884b',1,'cv::dnn::Layer::outputNameToIndex()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a275295575f6b1a7b5c68d414bf7530aa',1,'cv::dnn::LSTMLayer::outputNameToIndex()']]], + ['outputscount_457',['outputsCount',['https://docs.opencv.org/4.2.0/dd/df9/classcv_1_1dnn_1_1SplitLayer.html#a6baac6036050c1f496da8c18b87953c6',1,'cv::dnn::SplitLayer']]], + ['outshapes_458',['outShapes',['https://docs.opencv.org/4.2.0/db/d4d/structcv_1_1GKernel.html#aa6f01d884784857d41ecaa6fa8b30a0b',1,'cv::GKernel']]], + ['outtensor_459',['outTensor',['https://docs.opencv.org/4.2.0/de/d5f/structcv_1_1GPlaidMLContext.html#a1e1172f28b455bf4ed59e22c836e35f2',1,'cv::GPlaidMLContext']]], + ['outvalr_460',['outValR',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#a85b0ee69ff748139aabb7f94c62cc6f3',1,'cv::GCPUContext::outValR()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#ad61c8d7c7df84b5efef5db7527560cb4',1,'cv::GOCLContext::outValR()']]], + ['outvecr_461',['outVecR',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#ac63c2703e6f4e7ae1c6cf77607a4ef31',1,'cv::GCPUContext::outVecR()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a23b6577922d9c1b5b3bb835c16e76afa',1,'cv::GOCLContext::outVecR()']]], + ['outvecref_462',['outVecRef',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#aae9072800907251490f88444df8f8558',1,'cv::GCPUContext::outVecRef()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a0f5085f10ef2311591f023eedd0a0a49',1,'cv::GOCLContext::outVecRef()']]], + ['ov_5ftree_5fmap_463',['ov_tree_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html',1,'__gnu_pbds::detail']]], + ['ov_5ftree_5fmap_5f_2ehpp_464',['ov_tree_map_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01367.html',1,'']]], + ['ov_5ftree_5fmap_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_465',['ov_tree_map_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16697.html',1,'']]], + ['ov_5ftree_5fmap_5f_2fdebug_5ffn_5fimps_2ehpp_466',['ov_tree_map_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16769.html',1,'']]], + ['ov_5ftree_5fmap_5f_2ferase_5ffn_5fimps_2ehpp_467',['ov_tree_map_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16832.html',1,'']]], + ['ov_5ftree_5fmap_5f_2finfo_5ffn_5fimps_2ehpp_468',['ov_tree_map_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16967.html',1,'']]], + ['ov_5ftree_5fmap_5f_2finsert_5ffn_5fimps_2ehpp_469',['ov_tree_map_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17000.html',1,'']]], + ['ov_5ftree_5fmap_5f_2fiterators_5ffn_5fimps_2ehpp_470',['ov_tree_map_/iterators_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17051.html',1,'']]], + ['ov_5ftree_5fmap_5f_2fnode_5fiterators_2ehpp_471',['ov_tree_map_/node_iterators.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17111.html',1,'']]], + ['ov_5ftree_5fmap_5f_2fpolicy_5faccess_5ffn_5fimps_2ehpp_472',['ov_tree_map_/policy_access_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17159.html',1,'']]], + ['ov_5ftree_5fmap_5f_2fsplit_5fjoin_5ffn_5fimps_2ehpp_473',['ov_tree_map_/split_join_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17243.html',1,'']]], + ['ov_5ftree_5fmap_5f_2ftraits_2ehpp_474',['ov_tree_map_/traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17312.html',1,'']]], + ['ov_5ftree_5fnode_5fconst_5fit_5f_475',['ov_tree_node_const_it_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11863.html',1,'__gnu_pbds::detail']]], + ['ov_5ftree_5fnode_5fit_5f_476',['ov_tree_node_it_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11867.html',1,'__gnu_pbds::detail']]], + ['ov_5ftree_5ftag_477',['ov_tree_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11251.html',1,'__gnu_pbds']]], + ['overflow_478',['overflow',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'__gnu_cxx::enc_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'__gnu_cxx::stdio_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'__gnu_cxx::stdio_sync_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_filebuf< char_type, traits_type >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_streambuf< _Elem, _Tr >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_streambuf< char, _Traits >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_streambuf< char, char_traits< char > >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::basic_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::basic_streambuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::basic_stringbuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::wbuffer_convert::overflow()']]], + ['overflow_5ferror_479',['overflow_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02819.html',1,'std']]], + ['overlap_480',['overlap',['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html#aa34095c2f80741a929d8e7d3dad258c7',1,'cv::TrackerSamplerCS::Params::overlap'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#a6a56a625fb5fb0df7c63c69ce7713360',1,'cv::KeyPoint::overlap()']]], + ['overlaproi_481',['overlapRoi',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gaf9ff38a39051369119b53529b3d779ab',1,'cv::detail::overlapRoi()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gaf9ff38a39051369119b53529b3d779ab',1,'overlapRoi()(Global Namespace)']]], + ['oversampling_5famount_482',['oversampling_amount',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#ab2be0a345c572d46008ea33213e9822a',1,'cv::face::FacemarkKazemi::Params']]], + ['overview_483',['Overview',['https://docs.opencv.org/4.2.0/db/d87/md_gapi_doc_slides_README.html',1,'G-API Overview'],['https://docs.opencv.org/4.2.0/dc/dd6/ml_intro.html',1,'Machine Learning Overview'],['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'Video I/O with OpenCV Overview']]], + ['overview_484',['High-level design overview',['https://docs.opencv.org/4.2.0/de/d4d/gapi_hld.html',1,'']]], + ['overwrite_5fexisting_485',['overwrite_existing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a7d62790af546be3f895e613e37b0feac',1,'overwrite_existing(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a7d62790af546be3f895e613e37b0feac',1,'overwrite_existing(Global Namespace)']]], + ['ovis_2ehpp_486',['ovis.hpp',['https://docs.opencv.org/4.2.0/d6/d50/ovis_8hpp.html',1,'']]], + ['ovx_2ehpp_487',['ovx.hpp',['https://docs.opencv.org/4.2.0/dd/ded/ovx_8hpp.html',1,'']]], + ['ovx_5fdefs_2ehpp_488',['ovx_defs.hpp',['https://docs.opencv.org/4.2.0/de/d03/ovx__defs_8hpp.html',1,'']]], + ['own_20corner_20detector_489',['Creating your own corner detector',['https://docs.opencv.org/4.2.0/d9/dbc/tutorial_generic_corner_detector.html',1,'']]], + ['own_20linear_20filters_490',['Making your own linear filters!',['https://docs.opencv.org/4.2.0/d4/dbd/tutorial_filter_2d.html',1,'']]], + ['owner_5fall_491',['owner_all',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a3e6083e076d1f7125c0bbf7070df5440',1,'owner_all(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a3e6083e076d1f7125c0bbf7070df5440',1,'owner_all(Global Namespace)']]], + ['owner_5fexec_492',['owner_exec',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a189e890869453de458a9c5c26af8359b',1,'owner_exec(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a189e890869453de458a9c5c26af8359b',1,'owner_exec(Global Namespace)']]], + ['owner_5fless_493',['owner_less',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06907.html',1,'std']]], + ['owner_5fless_3c_20shared_5fptr_3c_20_5ftp_20_3e_20_3e_494',['owner_less< shared_ptr< _Tp > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09943.html',1,'std::experimental::fundamentals_v2::owner_less< shared_ptr< _Tp > >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06915.html',1,'std::owner_less< shared_ptr< _Tp > >']]], + ['owner_5fless_3c_20void_20_3e_495',['owner_less< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06911.html',1,'std']]], + ['owner_5fless_3c_20weak_5fptr_3c_20_5ftp_20_3e_20_3e_496',['owner_less< weak_ptr< _Tp > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09947.html',1,'std::experimental::fundamentals_v2::owner_less< weak_ptr< _Tp > >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06919.html',1,'std::owner_less< weak_ptr< _Tp > >']]], + ['owner_5fread_497',['owner_read',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a13804bd89bd86850b7c1b3cf17148c8b',1,'owner_read(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a13804bd89bd86850b7c1b3cf17148c8b',1,'owner_read(Global Namespace)']]], + ['owner_5fwrite_498',['owner_write',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a0d521a25ebf962a812b43c32fe36500e',1,'owner_write(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a0d521a25ebf962a812b43c32fe36500e',1,'owner_write(Global Namespace)']]] ]; diff --git a/search/all_19.js b/search/all_19.js index 20294a05..307318c0 100644 --- a/search/all_19.js +++ b/search/all_19.js @@ -1,7 +1,7 @@ var searchData= [ - ['p_0',['p',['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a3c627df1f79609c31cfb83c1044e9d25',1,'cv::AsyncArray::p'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#abbdcc54117a7b1c38826b697e94e9880',1,'cv::AsyncPromise::p'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#aa40f58476d9e54c1c58557f24eede23c',1,'cv::ocl::Context::p'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a6fc4df12367446f46501c676e9d54efc',1,'cv::ocl::Device::p'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html#a1d419e5c3062c54a3846a3d8abcb1634',1,'cv::CvLBPEvaluator::Feature::p'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af263d52c8a81f77e839385e1f6ec1e41',1,'cv::FileStorage::p'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#aa1e8b47ab87b910997f8dea0b5706b4e',1,'cv::ocl::Image2D::p'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a0275f89c9817453bcc4742b725ed00c4',1,'cv::ocl::Kernel::p'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a763e016ef3ff77fbc11620cc1631aab8',1,'cv::MatSize::p'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a6cb6d6a37bd88009069c9f2697397c87',1,'cv::MatStep::p'],['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html#a1eee8a411a7ff4ab839fd3a68c4d7fdb',1,'cv::datasets::MSM_epflObj::p'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#a1d55b26898db3753c73c450ded130268',1,'cv::ocl::Platform::p'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#a333ea49caa52e5f3def72a50f63ab5ac',1,'cv::ocl::PlatformInfo::p'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#acba6c3d3895d4c72a46849efb7570b0b',1,'cv::ocl::Program::p'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a68a27707560a79890587b8960ff25916',1,'cv::ocl::ProgramSource::p'],['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a2c9bd91207e53bcc71ccbe8620193135',1,'cv::QRCodeDetector::p'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#acab7b5c467168f6d2d1bad20dd1356cb',1,'cv::ocl::Queue::p'],['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html#aaa92382a2dc09e77ceea1f1ccb32b448',1,'cv::datasets::SLAM_kittiObj::p'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#ab1673e1dfc3eceaacd568a7ba99258e6',1,'cv::ocl::Timer::p'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#addcfd796c755aee31989d1fc69e24b46',1,'std::bernoulli_distribution::p()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#af0583bb444d7db7e7458dd1443ac7407',1,'std::binomial_distribution::p()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a3f50a0fa0b370466364b3928394c5fe3',1,'std::geometric_distribution::p()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#abb3aa564ac6719a607805597e9eb7493',1,'std::negative_binomial_distribution::p()']]], - ['p_1',['P',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3ae14aa4668daf05a4ea6918b10806acd5',1,'cv::ml::SVM']]], + ['p_0',['P',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3ae14aa4668daf05a4ea6918b10806acd5',1,'cv::ml::SVM']]], + ['p_1',['p',['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a3c627df1f79609c31cfb83c1044e9d25',1,'cv::AsyncArray::p'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#abbdcc54117a7b1c38826b697e94e9880',1,'cv::AsyncPromise::p'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#aa40f58476d9e54c1c58557f24eede23c',1,'cv::ocl::Context::p'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a6fc4df12367446f46501c676e9d54efc',1,'cv::ocl::Device::p'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html#a1d419e5c3062c54a3846a3d8abcb1634',1,'cv::CvLBPEvaluator::Feature::p'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af263d52c8a81f77e839385e1f6ec1e41',1,'cv::FileStorage::p'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#aa1e8b47ab87b910997f8dea0b5706b4e',1,'cv::ocl::Image2D::p'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a0275f89c9817453bcc4742b725ed00c4',1,'cv::ocl::Kernel::p'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a763e016ef3ff77fbc11620cc1631aab8',1,'cv::MatSize::p'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a6cb6d6a37bd88009069c9f2697397c87',1,'cv::MatStep::p'],['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html#a1eee8a411a7ff4ab839fd3a68c4d7fdb',1,'cv::datasets::MSM_epflObj::p'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#a1d55b26898db3753c73c450ded130268',1,'cv::ocl::Platform::p'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#a333ea49caa52e5f3def72a50f63ab5ac',1,'cv::ocl::PlatformInfo::p'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#acba6c3d3895d4c72a46849efb7570b0b',1,'cv::ocl::Program::p'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a68a27707560a79890587b8960ff25916',1,'cv::ocl::ProgramSource::p'],['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a2c9bd91207e53bcc71ccbe8620193135',1,'cv::QRCodeDetector::p'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#acab7b5c467168f6d2d1bad20dd1356cb',1,'cv::ocl::Queue::p'],['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html#aaa92382a2dc09e77ceea1f1ccb32b448',1,'cv::datasets::SLAM_kittiObj::p'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#ab1673e1dfc3eceaacd568a7ba99258e6',1,'cv::ocl::Timer::p'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#addcfd796c755aee31989d1fc69e24b46',1,'std::bernoulli_distribution::p()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#af0583bb444d7db7e7458dd1443ac7407',1,'std::binomial_distribution::p()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a3f50a0fa0b370466364b3928394c5fe3',1,'std::geometric_distribution::p()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#abb3aa564ac6719a607805597e9eb7493',1,'std::negative_binomial_distribution::p()']]], ['p0_2',['p0',['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#a8ba422197129718c2d1cfe769f16dae0',1,'cv::CvHOGEvaluator::Feature::p0'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga414eb795c106b63e25d98d0c1d2b817d',1,'cv::stereo::Match::p0'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga414eb795c106b63e25d98d0c1d2b817d',1,'p0(Global Namespace)']]], ['p1_3',['p1',['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#a1ae6805d8ab0fc498b223a6dc446a6cc',1,'cv::CvHOGEvaluator::Feature::p1'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gaf5b87376a1e4002266e1480dd6dd43ff',1,'cv::stereo::Match::p1'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gaf5b87376a1e4002266e1480dd6dd43ff',1,'p1(Global Namespace)']]], ['p2_4',['p2',['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#ab2b8a2754b6b26d4f9e3ff2dd9c08e0d',1,'cv::CvHOGEvaluator::Feature']]], @@ -34,7 +34,7 @@ var searchData= ['pair_3c_20_5fbi_5fiter_2c_20_5fbi_5fiter_20_3e_31',['pair< _Bi_iter, _Bi_iter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], ['pair_3c_20_5fbiiter_2c_20_5fbiiter_20_3e_32',['pair< _BiIter, _BiIter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], ['pair_3c_20_5fiterator1_2c_20_5fiterator2_20_3e_33',['pair< _Iterator1, _Iterator2 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], - ['pair_3c_20_5fraiter_2c_20_5fraiter_20_3e_34',['pair< _RAIter, _RAIter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], + ['pair_3c_20_5fraiter_2c_20_5fraiter_20_3e_34',['pair< _RAIter, _RAIter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'pair< _RAIter, _RAIter >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'std::pair< _RAIter, _RAIter >']]], ['pair_3c_20char_2c_20_5ftokent_20_3e_35',['pair< char, _TokenT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], ['pair_3c_20char_2c_20char_20_3e_36',['pair< char, char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], ['pair_3c_20entry_5fpointer_2c_20typename_20_5falloc_3a_3asize_5ftype_20_3e_37',['pair< entry_pointer, typename _Alloc::size_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], @@ -81,852 +81,844 @@ var searchData= ['parallelize_20your_20code_78',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], ['parallelloopbody_79',['ParallelLoopBody',['https://docs.opencv.org/4.2.0/d2/d74/classcv_1_1ParallelLoopBody.html',1,'cv']]], ['parallelloopbodylambdawrapper_80',['ParallelLoopBodyLambdaWrapper',['https://docs.opencv.org/4.2.0/d3/d78/classcv_1_1ParallelLoopBodyLambdaWrapper.html',1,'cv::ParallelLoopBodyLambdaWrapper'],['https://docs.opencv.org/4.2.0/d3/d78/classcv_1_1ParallelLoopBodyLambdaWrapper.html#a896e58f5b0957652122b67f38b008403',1,'cv::ParallelLoopBodyLambdaWrapper::ParallelLoopBodyLambdaWrapper()']]], - ['param_81',['Param',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gaca27dc931e295b733e740c3601f697a6',1,'cv::stereo::QuasiDenseStereo']]], + ['param_81',['Param',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gaca27dc931e295b733e740c3601f697a6',1,'cv::stereo::QuasiDenseStereo::Param'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79a',1,'cv::Param'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79a',1,'Param(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gaca27dc931e295b733e740c3601f697a6',1,'Param(Global Namespace)']]], ['param_82',['param',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ad8b960699602dcafa9a4ca3895fa776a',1,'gamma_distribution< double >::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ac1e8d68c10521bff382e0a14587d1dc4',1,'gamma_distribution< double >::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ad8b960699602dcafa9a4ca3895fa776a',1,'gamma_distribution< result_type >::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ac1e8d68c10521bff382e0a14587d1dc4',1,'gamma_distribution< result_type >::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a63085cf246a895f8b03ccb632d4fd0c7',1,'normal_distribution< double >::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a9e150060b4fd9ea4fef8f07d8b249944',1,'normal_distribution< double >::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a63085cf246a895f8b03ccb632d4fd0c7',1,'normal_distribution< result_type >::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a9e150060b4fd9ea4fef8f07d8b249944',1,'normal_distribution< result_type >::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#a87898c9d5ca977d0d4c7d32996aff34e',1,'std::bernoulli_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#addd7642a0dc7aeb3025fd98670eb2ae4',1,'std::bernoulli_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a999c47841c55d2615178786296635761',1,'std::binomial_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a77ced711f56a6b1dabc97cae8c0e70d7',1,'std::binomial_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#ac85420c7ac3f7d2c83c3a7484facad86',1,'std::cauchy_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#aef17e054f8317d965a4baf4fa0424760',1,'std::cauchy_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a43a4a1e17f1083b6f67fb08037956f9e',1,'std::chi_squared_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#aa17c3dc11719efd80ca2aefee1a07044',1,'std::chi_squared_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a57aea1784603fcbb8af7480bc0b9e16c',1,'std::discrete_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#ad2a6bbcde16e1eb36226f579536bb166',1,'std::discrete_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a79a2944c707f21d96fb329d89c001cb0',1,'std::exponential_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#ac53c5c21d59b131a95ca5d5d8fdfe37a',1,'std::exponential_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#afef9a5a4a38b2155d763a38571ee3e41',1,'std::extreme_value_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#a9a82202d5349aaa0565e08305e3f0de0',1,'std::extreme_value_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a64441f490b89c34e0fe852bff1cb335d',1,'std::fisher_f_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a052913a3ca616ba45870d25e5f1da93c',1,'std::fisher_f_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ad8b960699602dcafa9a4ca3895fa776a',1,'std::gamma_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ac1e8d68c10521bff382e0a14587d1dc4',1,'std::gamma_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a690e55bc0b6fe8c78d4e46a08197e70b',1,'std::geometric_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a75d3adb67d1d8a8d9ec152ed6076a009',1,'std::geometric_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#a3533e00011a0d32c89697c809c98c765',1,'std::lognormal_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#ae0ec61a8aca3872ff4b8a16e4696ad90',1,'std::lognormal_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#af44b23f905d775ec72b31cf9e4012f2f',1,'std::negative_binomial_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#aaa0499f09e9952646ce78e9c68c8d1d3',1,'std::negative_binomial_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a63085cf246a895f8b03ccb632d4fd0c7',1,'std::normal_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a9e150060b4fd9ea4fef8f07d8b249944',1,'std::normal_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a6f56727fdb4b5b527bf40f2c314864d8',1,'std::piecewise_constant_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a0d1ca073930f46f31b1508711ea230c8',1,'std::piecewise_constant_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a790278cbfca48c97ba9a018deb24f208',1,'std::piecewise_linear_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#abda82e975655fec753ac6a3639d6a6f8',1,'std::piecewise_linear_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#ad2d0adb28e17e439f2940bf737aaeb50',1,'std::poisson_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#ac0233f87c798faa09a5cbeb91969bd8c',1,'std::poisson_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#af8715393519007f3325e7b696fc07967',1,'std::student_t_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a1419abb07831366ab3d01907a8057427',1,'std::student_t_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#afe06b7c82cfcd532367a8fbf1777156f',1,'std::uniform_int_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a65a393980944ebc11e0ea286a327d05b',1,'std::uniform_int_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#a3122c357fd99615bbd4a8c488f7d6736',1,'std::uniform_real_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#af4f7361528ea5e52ba65da30a8172ec4',1,'std::uniform_real_distribution::param(const param_type &__param)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a0692a12edf7b4c887267b18fa5fee26e',1,'std::weibull_distribution::param() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a880a3c1ec45f86dd2e64d89d7e64e527',1,'std::weibull_distribution::param(const param_type &__param)']]], - ['param_83',['Param',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79a',1,'cv::Param'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79a',1,'Param(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gaca27dc931e295b733e740c3601f697a6',1,'Param(Global Namespace)']]], - ['param_5ftype_84',['param_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06431.html',1,'std::bernoulli_distribution::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06439.html',1,'std::binomial_distribution< _IntType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06407.html',1,'std::cauchy_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06399.html',1,'std::chi_squared_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06495.html',1,'std::discrete_distribution< _IntType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06471.html',1,'std::exponential_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06487.html',1,'std::extreme_value_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06415.html',1,'std::fisher_f_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06391.html',1,'std::gamma_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06447.html',1,'std::geometric_distribution< _IntType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06383.html',1,'std::lognormal_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06455.html',1,'std::negative_binomial_distribution< _IntType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06375.html',1,'std::normal_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06503.html',1,'std::piecewise_constant_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06511.html',1,'std::piecewise_linear_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06463.html',1,'std::poisson_distribution< _IntType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06423.html',1,'std::student_t_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07987.html',1,'std::uniform_int_distribution< _IntType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06367.html',1,'std::uniform_real_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06479.html',1,'std::weibull_distribution< _RealType >::param_type']]], - ['paramdesc_85',['ParamDesc',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html',1,'cv::gapi::ie::detail']]], - ['parameter_20file_86',['Exporting a template parameter file',['https://docs.opencv.org/4.2.0/df/dc0/tutorial_qds_export_parameters.html',1,'']]], - ['parameter_5ftype_87',['parameter_type',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a348b7e31dc03183136269b9be4aaacf9',1,'cv::cudev::TypeTraits']]], - ['parameters_88',['Parameters',['../cameraconfig.html#intrinsic',1,'Intrinsic Parameters'],['https://docs.opencv.org/4.2.0/d4/d80/structcv_1_1DetectionBasedTracker_1_1Parameters.html',1,'cv::DetectionBasedTracker::Parameters']]], - ['parameters_89',['parameters',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#af2c3de5745a8eb4312db652276d387e3',1,'cv::DetectionBasedTracker']]], - ['parameters_90',['Parameters',['https://docs.opencv.org/4.2.0/d4/d80/structcv_1_1DetectionBasedTracker_1_1Parameters.html#a53c869cca43fe05698fa7b64d3e969a0',1,'cv::DetectionBasedTracker::Parameters::Parameters()'],['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'Writing Functions Taking Eigen Types as Parameters']]], - ['parametrizedline_91',['ParametrizedLine',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html',1,'Eigen::ParametrizedLine< class, _AmbientDim, _Options >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a43e71a77728409e15220495dc9724f04',1,'Eigen::ParametrizedLine::ParametrizedLine()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a3f26a2ac6fe39d39ba72e148f0f877ad',1,'Eigen::ParametrizedLine::ParametrizedLine(const Hyperplane< _Scalar, _AmbientDim, OtherOptions > &hyperplane)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#abf4318b4e0c2469e83ab049c9c177b80',1,'Eigen::ParametrizedLine::ParametrizedLine(const ParametrizedLine< OtherScalarType, AmbientDimAtCompileTime, OtherOptions > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a9ae3a16ee1d2a6cf09f45007451fa148',1,'Eigen::ParametrizedLine::ParametrizedLine(const VectorType &origin, const VectorType &direction)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a5261e771f71d975eaa9ebf8bc598129b',1,'Eigen::ParametrizedLine::ParametrizedLine(Index _dim)']]], - ['paramgrid_92',['ParamGrid',['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html',1,'cv::ml::ParamGrid'],['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a41f16ee1570e78af0d7362231138cc6c',1,'cv::ml::ParamGrid::ParamGrid()'],['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a4b8034d10d8dd7f083967176dc71d09b',1,'cv::ml::ParamGrid::ParamGrid(double _minVal, double _maxVal, double _logStep)']]], - ['params_93',['Params',['https://docs.opencv.org/4.2.0/d6/dad/structcv_1_1ClfMilBoost_1_1Params.html',1,'cv::ClfMilBoost::Params'],['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html',1,'cv::dynafu::Params'],['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html',1,'cv::face::FacemarkAAM::Params'],['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html',1,'cv::face::FacemarkKazemi::Params'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html',1,'cv::face::FacemarkLBF::Params'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html',1,'cv::gapi::ie::Params< class >'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html',1,'cv::kinfu::Params'],['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html',1,'cv::line_descriptor::BinaryDescriptor::Params'],['https://docs.opencv.org/4.2.0/d6/d86/structcv_1_1phase__unwrapping_1_1HistogramPhaseUnwrapping_1_1Params.html',1,'cv::phase_unwrapping::HistogramPhaseUnwrapping::Params'],['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html',1,'cv::SimpleBlobDetector::Params'],['https://docs.opencv.org/4.2.0/d3/d4d/structcv_1_1structured__light_1_1GrayCodePattern_1_1Params.html',1,'cv::structured_light::GrayCodePattern::Params'],['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html',1,'cv::structured_light::SinusoidalPattern::Params'],['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html',1,'cv::TrackerBoosting::Params'],['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html',1,'cv::TrackerCSRT::Params'],['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html',1,'cv::TrackerFeatureHAAR::Params'],['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1TrackerGOTURN_1_1Params.html',1,'cv::TrackerGOTURN::Params'],['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html',1,'cv::TrackerKCF::Params'],['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html',1,'cv::TrackerMedianFlow::Params'],['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html',1,'cv::TrackerMIL::Params'],['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html',1,'cv::TrackerSamplerCS::Params'],['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html',1,'cv::TrackerSamplerCSC::Params'],['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html',1,'cv::TrackerSamplerPF::Params'],['https://docs.opencv.org/4.2.0/d3/dd0/structcv_1_1TrackerTLD_1_1Params.html',1,'cv::TrackerTLD::Params']]], - ['params_94',['params',['https://docs.opencv.org/4.2.0/da/dcd/structcv_1_1gapi_1_1GNetParam.html#aa66fcf43899f80cbddde27cee936390c',1,'cv::gapi::GNetParam::params'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a84e511f810b67411fddd2e5fbd8be6be',1,'cv::tbm::ITrackerByMatching::params()'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#a45f7b71e9007db6f13cb1535ce9b1a37',1,'cv::gapi::ie::Params::params()']]], - ['params_95',['Params',['https://docs.opencv.org/4.2.0/d6/dad/structcv_1_1ClfMilBoost_1_1Params.html#a26197941a32d517c283cdc70f37bd76d',1,'cv::ClfMilBoost::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a4f7223785437a747780c7aed2df56d2e',1,'cv::TrackerSamplerCSC::Params::Params()'],['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html#a694d900b5d61c8690d4eae9dd6b0e9dd',1,'cv::TrackerSamplerCS::Params::Params()'],['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html#ad3f4f9d15af6556af91a45162366c6d3',1,'cv::TrackerSamplerPF::Params::Params()'],['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html#afe18591df265dadb5c708db996efa863',1,'cv::TrackerFeatureHAAR::Params::Params()'],['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html#a652b1b2c3e203bbca771883fdc09d551',1,'cv::TrackerMIL::Params::Params()'],['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#a7da79b1b870c2531cb9f9443593afe2b',1,'cv::TrackerBoosting::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/dd0/structcv_1_1TrackerTLD_1_1Params.html#a75686a52571df4ab2103524426d19006',1,'cv::TrackerTLD::Params::Params()'],['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a4ec755b778a69abf371b7b1f4ef9adda',1,'cv::TrackerKCF::Params::Params()'],['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1TrackerGOTURN_1_1Params.html#a509595d2caf0e2834c59bb380e6081e3',1,'cv::TrackerGOTURN::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a2b46465864ef259b3f76e0f43ed6d872',1,'cv::TrackerCSRT::Params::Params()'],['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#a3482c25c0512983c3a26c7cd612e5557',1,'cv::TrackerMedianFlow::Params::Params()'],['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a02c43ee3252633ac4106c00a680fa747',1,'cv::face::FacemarkKazemi::Params::Params()'],['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#a0262d5324ee1d9e7333d776aa944bc86',1,'cv::face::FacemarkAAM::Params::Params()'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a60df8fda3e1925ba584122a1ea64803e',1,'cv::face::FacemarkLBF::Params::Params()'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#abe0385ab38d7f17f4255fab7047e4440',1,'cv::gapi::ie::Params::Params()'],['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#aeabdb46e1e7238a3d081eb0c6b36169b',1,'cv::SimpleBlobDetector::Params::Params()'],['https://docs.opencv.org/4.2.0/d6/d86/structcv_1_1phase__unwrapping_1_1HistogramPhaseUnwrapping_1_1Params.html#ae694509893f66be9e2c62e00b6374339',1,'cv::phase_unwrapping::HistogramPhaseUnwrapping::Params::Params()'],['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#a4cd7ec719c6c86c13faa82115c43f217',1,'cv::line_descriptor::BinaryDescriptor::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/d4d/structcv_1_1structured__light_1_1GrayCodePattern_1_1Params.html#a6b32437033328592a235f76f7ed119af',1,'cv::structured_light::GrayCodePattern::Params::Params()'],['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#ab214b6cd84af5b3e5b759e5f6f731edd',1,'cv::structured_light::SinusoidalPattern::Params::Params()']]], - ['params_2eh_96',['params.h',['https://docs.opencv.org/4.2.0/da/d33/params_8h.html',1,'']]], - ['paramtype_97',['ParamType',['https://docs.opencv.org/4.2.0/dd/d77/structcv_1_1ParamType.html',1,'cv']]], - ['paramtype_3c_20_5ftp_2c_20typename_20std_3a_3aenable_5fif_3c_20std_3a_3ais_5fenum_3c_20_5ftp_20_3e_3a_3avalue_20_3e_3a_3atype_20_3e_98',['ParamType< _Tp, typename std::enable_if< std::is_enum< _Tp >::value >::type >',['https://docs.opencv.org/4.2.0/db/d0d/structcv_1_1ParamType_3_01__Tp_00_01typename_01std_1_1enable__if_3_01std_1_1is__enum_3_01__Tp_01_4_1_1value_01_4_1_1type_01_4.html',1,'cv']]], - ['paramtype_3c_20algorithm_20_3e_99',['ParamType< Algorithm >',['https://docs.opencv.org/4.2.0/d2/d39/structcv_1_1ParamType_3_01Algorithm_01_4.html',1,'cv']]], - ['paramtype_3c_20bool_20_3e_100',['ParamType< bool >',['https://docs.opencv.org/4.2.0/d1/d87/structcv_1_1ParamType_3_01bool_01_4.html',1,'cv']]], - ['paramtype_3c_20double_20_3e_101',['ParamType< double >',['https://docs.opencv.org/4.2.0/d4/d98/structcv_1_1ParamType_3_01double_01_4.html',1,'cv']]], - ['paramtype_3c_20float_20_3e_102',['ParamType< float >',['https://docs.opencv.org/4.2.0/dd/df2/structcv_1_1ParamType_3_01float_01_4.html',1,'cv']]], - ['paramtype_3c_20mat_20_3e_103',['ParamType< Mat >',['https://docs.opencv.org/4.2.0/db/d5f/structcv_1_1ParamType_3_01Mat_01_4.html',1,'cv']]], - ['paramtype_3c_20scalar_20_3e_104',['ParamType< Scalar >',['https://docs.opencv.org/4.2.0/d2/dda/structcv_1_1ParamType_3_01Scalar_01_4.html',1,'cv']]], - ['paramtype_3c_20std_3a_3avector_3c_20mat_20_3e_20_3e_105',['ParamType< std::vector< Mat > >',['https://docs.opencv.org/4.2.0/dc/d1c/structcv_1_1ParamType_3_01std_1_1vector_3_01Mat_01_4_01_4.html',1,'cv']]], - ['paramtype_3c_20string_20_3e_106',['ParamType< String >',['https://docs.opencv.org/4.2.0/d0/d5f/structcv_1_1ParamType_3_01String_01_4.html',1,'cv']]], - ['paramtype_3c_20uchar_20_3e_107',['ParamType< uchar >',['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1ParamType_3_01uchar_01_4.html',1,'cv']]], - ['paramtype_3c_20uint64_20_3e_108',['ParamType< uint64 >',['https://docs.opencv.org/4.2.0/dc/d63/structcv_1_1ParamType_3_01uint64_01_4.html',1,'cv']]], - ['paramtype_3c_20unsigned_20_3e_109',['ParamType< unsigned >',['https://docs.opencv.org/4.2.0/d7/d68/structcv_1_1ParamType_3_01unsigned_01_4.html',1,'cv']]], - ['paramtypes_110',['ParamTypes',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3',1,'cv::ml::SVM']]], - ['parasolcells_5fbeta_111',['parasolCells_beta',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a1705f791f4a5d5b6745fb31e61763e1b',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters']]], - ['parasolcells_5fk_112',['parasolCells_k',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a24aec5077fabb9a09f8ab1c97f64a265',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters']]], - ['parasolcells_5ftau_113',['parasolCells_tau',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a164ab19d1ffe43c1a3ef9c230065488e',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters']]], - ['pardisoldlt_114',['PardisoLDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1PardisoLDLT.html',1,'Eigen']]], - ['pardisollt_115',['PardisoLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1PardisoLLT.html',1,'Eigen']]], - ['pardisolu_116',['PardisoLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1PardisoLU.html',1,'Eigen']]], - ['pardisosupport_20module_117',['PardisoSupport module',['https://eigen.tuxfamily.org/dox/group__PardisoSupport__Module.html',1,'']]], - ['parent_118',['parent',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#a1663942a3058de8c0835cdc657fd3591',1,'cv::detail::DisjointSets::parent'],['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#aae48a9dbfb39eb84cfcf2e7677e7c4d0',1,'cv::text::ERStat::parent'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#a4662282b3b556ee685a3fd4ba927a153',1,'cv::ml::DTrees::Node::parent']]], - ['parent_5fpointer_119',['parent_pointer',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_afdaacce1edb7145e0434e014f0e8685a.html#afdaacce1edb7145e0434e014f0e8685a',1,'nlohmann::json_pointer']]], - ['parentview_120',['parentView',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a1f073867d25d504a7935ac813180518a',1,'CvAbstractCamera']]], - ['parse_121',['parse',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a15018ade392a844ea32d5188d1a0b9c6.html#a15018ade392a844ea32d5188d1a0b9c6',1,'nlohmann::basic_json::parse(InputType &&i, const parser_callback_t cb=nullptr, const bool allow_exceptions=true, const bool ignore_comments=false)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad832c70af0989389a9a104c21d2d1c5c.html#ad832c70af0989389a9a104c21d2d1c5c',1,'nlohmann::basic_json::parse(IteratorType first, IteratorType last, const parser_callback_t cb=nullptr, const bool allow_exceptions=true, const bool ignore_comments=false)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a73cf15644f04fa569f50291049d1bafd.html#a73cf15644f04fa569f50291049d1bafd',1,'nlohmann::basic_json::parse(detail::span_input_adapter &&i, const parser_callback_t cb=nullptr, const bool allow_exceptions=true, const bool ignore_comments=false)']]], - ['parse_5ferror_122',['parse_error',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a555b05e9da63d486126759922685a37a.html#a555b05e9da63d486126759922685a37a',1,'nlohmann::basic_json::parse_error'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a60287e3bd85f489e04c83f7e3b76e613.html#a60287e3bd85f489e04c83f7e3b76e613',1,'nlohmann::json_sax::parse_error()']]], - ['parse_5fevent_5ft_123',['parse_event_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a24086b03c5c063849df0307f78c41c54.html#a24086b03c5c063849df0307f78c41c54',1,'nlohmann::basic_json']]], - ['parse_5fnumbers_2eh_124',['parse_numbers.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00440.html',1,'']]], - ['parseavi_125',['parseAvi',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a4c06bb278da8365befa6b0102e66ba51',1,'cv::AVIReadContainer::parseAvi(Codecs codec_)'],['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a4f53539ac4dac515adb75a4f1aa685e4',1,'cv::AVIReadContainer::parseAvi(frame_list &in_frame_list, Codecs codec_)']]], - ['parseaviwithframelist_126',['parseAviWithFrameList',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a93c6c6887e5ff4d4eb80b33d0e19b023',1,'cv::AVIReadContainer']]], - ['parsehdrllist_127',['parseHdrlList',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a4f26cdb8565eb7c0a46ae73603046624',1,'cv::AVIReadContainer']]], - ['parseindex_128',['parseIndex',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a1ee25d593d9ede33f708131980d27c8a',1,'cv::AVIReadContainer']]], - ['parseinfo_129',['parseInfo',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a695c50eebb1689055e06b0c105e12025',1,'cv::AVIReadContainer']]], - ['parsemovi_130',['parseMovi',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a2e34cdd82292614e21a05c6e7d36263d',1,'cv::AVIReadContainer']]], - ['parser_5fcallback_5ft_131',['parser_callback_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0273d074462644e5d5a7ff313ad0d742.html#a0273d074462644e5d5a7ff313ad0d742',1,'nlohmann::basic_json']]], - ['parseriff_132',['parseRiff',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ab7e82462d39dd2a75de9dc34ca9e2ed5',1,'cv::AVIReadContainer']]], - ['parsestrl_133',['parseStrl',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ac47b36db52d61f80c63946636c46142e',1,'cv::AVIReadContainer']]], - ['part_134',['Core part',['https://docs.opencv.org/4.2.0/d7/d05/group__cudacore.html',1,'']]], - ['part_20based_20models_135',['Deformable Part-based Models',['https://docs.opencv.org/4.2.0/d9/d12/group__dpm.html',1,'']]], - ['partial_20list_20of_20implemented_20layers_136',['Partial List of Implemented Layers',['https://docs.opencv.org/4.2.0/d6/d87/group__dnnLayerList.html',1,'']]], - ['partial_5fsort_137',['partial_sort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga91f25d546637f075de3958a25928b687',1,'std::partial_sort(_RandomAccessIterator __first, _RandomAccessIterator __middle, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6401ff7e25d2ef7a6119d894cb40eec0',1,'std::partial_sort(_RandomAccessIterator __first, _RandomAccessIterator __middle, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga91f25d546637f075de3958a25928b687',1,'partial_sort(_RandomAccessIterator __first, _RandomAccessIterator __middle, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6401ff7e25d2ef7a6119d894cb40eec0',1,'partial_sort(_RandomAccessIterator __first, _RandomAccessIterator __middle, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['partial_5fsort_5fcopy_138',['partial_sort_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7b262260421978833cc1b1c6b3969bb4',1,'std::partial_sort_copy(_InputIterator __first, _InputIterator __last, _RandomAccessIterator __result_first, _RandomAccessIterator __result_last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaf53e3f9d5e3c9cd4d36a0801d411e324',1,'std::partial_sort_copy(_InputIterator __first, _InputIterator __last, _RandomAccessIterator __result_first, _RandomAccessIterator __result_last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7b262260421978833cc1b1c6b3969bb4',1,'partial_sort_copy(_InputIterator __first, _InputIterator __last, _RandomAccessIterator __result_first, _RandomAccessIterator __result_last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaf53e3f9d5e3c9cd4d36a0801d411e324',1,'partial_sort_copy(_InputIterator __first, _InputIterator __last, _RandomAccessIterator __result_first, _RandomAccessIterator __result_last, _Compare __comp)(Global Namespace)']]], - ['partial_5fsort_5fminimal_5fn_139',['partial_sort_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a79a53af11312c55af15998bf7a3f46d3',1,'__gnu_parallel::_Settings']]], - ['partial_5fsum_140',['partial_sum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga9151a0519f8c180edbef22197f39dd5e',1,'std::partial_sum(_InputIterator __first, _InputIterator __last, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga17bad49fa9fb1c5c41d019b16970fe9e',1,'std::partial_sum(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _BinaryOperation __binary_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga9151a0519f8c180edbef22197f39dd5e',1,'partial_sum(_InputIterator __first, _InputIterator __last, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga17bad49fa9fb1c5c41d019b16970fe9e',1,'partial_sum(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _BinaryOperation __binary_op)(Global Namespace)']]], - ['partial_5fsum_2eh_141',['partial_sum.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00944.html',1,'']]], - ['partial_5fsum_5fdilation_142',['partial_sum_dilation',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a781c6a0034d1669b90e37407e1c6d09e',1,'__gnu_parallel::_Settings']]], - ['partial_5fsum_5fminimal_5fn_143',['partial_sum_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a768fbc7a7e588eabb25fd3824c4322fb',1,'__gnu_parallel::_Settings']]], - ['partialpivlu_144',['PartialPivLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html',1,'Eigen']]], - ['partialpivlu_145',['partialPivLu',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a6199d8aaf26c1b8ac3097fdfa7733a1e',1,'Eigen::MatrixBase::partialPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a6199d8aaf26c1b8ac3097fdfa7733a1e',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::partialPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a6199d8aaf26c1b8ac3097fdfa7733a1e',1,'MatrixBase< Solve< Decomposition, RhsType > >::partialPivLu()']]], - ['partialpivlu_146',['PartialPivLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a5c04818d354f94a98786d8a44cb709c6',1,'Eigen::PartialPivLU::PartialPivLU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#acf37214aebb54d0e186ae39ac6c41bdf',1,'Eigen::PartialPivLU::PartialPivLU(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a4efc917d31d0e9d76781a97509309061',1,'Eigen::PartialPivLU::PartialPivLU(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#acf892c12d8a229b32bddc3149e32e63a',1,'Eigen::PartialPivLU::PartialPivLU(Index size)']]], - ['partialreduxexpr_147',['PartialReduxExpr',['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialReduxExpr.html',1,'Eigen']]], - ['particlesnum_148',['particlesNum',['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html#a82ecefe2fc5d73bc1a935b7611a8fe56',1,'cv::TrackerSamplerPF::Params']]], - ['partition_149',['partition',['https://docs.opencv.org/4.2.0/d5/d38/group__core__cluster.html#ga2037c989e69b499c1aa271419f3a9b34',1,'partition()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga64c8d89411856cea58194aa69a3c37f3',1,'std::partition()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga64c8d89411856cea58194aa69a3c37f3',1,'partition(_ForwardIterator __first, _ForwardIterator __last, _Predicate __pred)(Global Namespace)']]], - ['partition_2eh_150',['partition.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00947.html',1,'']]], - ['partition_5fchunk_5fshare_151',['partition_chunk_share',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#aaac9b17f2715c8b9101a2905562a43d1',1,'__gnu_parallel::_Settings']]], - ['partition_5fchunk_5fsize_152',['partition_chunk_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ad796aab8446ea9eaadfbc0b7b0787c71',1,'__gnu_parallel::_Settings']]], - ['partition_5fcopy_153',['partition_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga15ed8c195c2228b62770f24b4fd9de05',1,'std::partition_copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga15ed8c195c2228b62770f24b4fd9de05',1,'partition_copy()(Global Namespace)']]], - ['partition_5fminimal_5fn_154',['partition_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ae56b6a01dc27becaa478828011527b4b',1,'__gnu_parallel::_Settings']]], - ['partition_5fpoint_155',['partition_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaca57a24221766660c3b9d83e2b3f8f97',1,'std::partition_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaca57a24221766660c3b9d83e2b3f8f97',1,'partition_point()(Global Namespace)']]], - ['parts_156',['parts',['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#a4e122399c7fa8be98a94ba25fe62ee29',1,'cv::datasets::PascalObj']]], - ['parts_20of_20eigen_157',['Experimental parts of Eigen',['https://eigen.tuxfamily.org/dox/Experimental.html',1,'']]], - ['pascalobj_158',['PascalObj',['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html',1,'cv::datasets']]], - ['pascalpart_159',['PascalPart',['https://docs.opencv.org/4.2.0/d6/d4e/structcv_1_1datasets_1_1PascalPart.html',1,'cv::datasets']]], - ['pass_160',['pass',['https://docs.opencv.org/4.2.0/dc/d02/classcv_1_1GCall.html#abfe18fdb44602c8bb442d107b7f785ac',1,'cv::GCall']]], - ['passing_20eigen_20objects_20by_20value_20to_20functions_161',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], - ['pastixldlt_162',['PastixLDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLDLT.html',1,'Eigen']]], - ['pastixllt_163',['PastixLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLLT.html',1,'Eigen']]], - ['pastixlu_164',['PastixLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLU.html',1,'Eigen']]], - ['pastixsupport_20module_165',['PaStiXSupport module',['https://eigen.tuxfamily.org/dox/group__PaStiXSupport__Module.html',1,'']]], - ['pat_166',['pat',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a51cc7ec239bc574f3ba40cd4fe5c9475',1,'cv::datasets::pat'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a51cc7ec239bc574f3ba40cd4fe5c9475',1,'pat(Global Namespace)']]], - ['pat_5ftrie_5f_2ehpp_167',['pat_trie_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01376.html',1,'']]], - ['pat_5ftrie_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_168',['pat_trie_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16703.html',1,'']]], - ['pat_5ftrie_5f_2fdebug_5ffn_5fimps_2ehpp_169',['pat_trie_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16775.html',1,'']]], - ['pat_5ftrie_5f_2ferase_5ffn_5fimps_2ehpp_170',['pat_trie_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16838.html',1,'']]], - ['pat_5ftrie_5f_2ffind_5ffn_5fimps_2ehpp_171',['pat_trie_/find_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16886.html',1,'']]], - ['pat_5ftrie_5f_2finfo_5ffn_5fimps_2ehpp_172',['pat_trie_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16970.html',1,'']]], - ['pat_5ftrie_5f_2fiterators_5ffn_5fimps_2ehpp_173',['pat_trie_/iterators_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17054.html',1,'']]], - ['pat_5ftrie_5f_2fpolicy_5faccess_5ffn_5fimps_2ehpp_174',['pat_trie_/policy_access_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17162.html',1,'']]], - ['pat_5ftrie_5f_2fr_5ferase_5ffn_5fimps_2ehpp_175',['pat_trie_/r_erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17168.html',1,'']]], - ['pat_5ftrie_5f_2frotate_5ffn_5fimps_2ehpp_176',['pat_trie_/rotate_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17210.html',1,'']]], - ['pat_5ftrie_5f_2ftrace_5ffn_5fimps_2ehpp_177',['pat_trie_/trace_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17297.html',1,'']]], - ['pat_5ftrie_5f_2ftraits_2ehpp_178',['pat_trie_/traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17315.html',1,'']]], - ['pat_5ftrie_5fbase_179',['pat_trie_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11903.html',1,'__gnu_pbds::detail']]], - ['pat_5ftrie_5fbase_2ehpp_180',['pat_trie_base.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01379.html',1,'']]], - ['pat_5ftrie_5fmap_181',['pat_trie_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html',1,'__gnu_pbds::detail']]], - ['pat_5ftrie_5ftag_182',['pat_trie_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11259.html',1,'__gnu_pbds']]], - ['patch_183',['patch',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_adcc786998f220a5b3083ee8a37c4553e.html#adcc786998f220a5b3083ee8a37c4553e',1,'nlohmann::basic_json']]], - ['patch_5fsize_5fx_184',['patch_size_x',['https://docs.opencv.org/4.2.0/d2/d04/structcv_1_1cudev_1_1DefaultGlobReducePolicy.html#a1ad0902ac493453c5843538f7fc0ded7a93d9da236bf4870be3428bb928438e5c',1,'cv::cudev::DefaultGlobReducePolicy']]], - ['patch_5fsize_5fy_185',['patch_size_y',['https://docs.opencv.org/4.2.0/d2/d04/structcv_1_1cudev_1_1DefaultGlobReducePolicy.html#a1ad0902ac493453c5843538f7fc0ded7a99411a640813e3b8dc222cae869d39c7',1,'cv::cudev::DefaultGlobReducePolicy']]], - ['patchnans_186',['patchNaNs',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga62286befb7cde3568ff8c7d14d5079da',1,'cv::patchNaNs()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga62286befb7cde3568ff8c7d14d5079da',1,'patchNaNs()(Global Namespace)']]], - ['path_187',['path',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09859.html',1,'std::experimental::filesystem::v1::path'],['https://docs.opencv.org/4.2.0/d6/d08/structcv_1_1gapi_1_1wip_1_1draw_1_1freetype__font.html#a43b1077a80176caa1c45e4a1eef21d4d',1,'cv::gapi::wip::draw::freetype_font::path']]], - ['path_188',['PATH',['https://docs.opencv.org/4.2.0/d0/da3/classcv_1_1viz_1_1WTrajectory.html#af448f4e56e68f9d7e1bd1a2c5fce691fa27fc06657f7d3061bd07d6e7192a2006',1,'cv::viz::WTrajectory']]], - ['paths_189',['paths',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1datasets_1_1FR__adience.html#a7b941899b9f20f8994e1a992e34bacaa',1,'cv::datasets::FR_adience::paths'],['https://docs.opencv.org/4.2.0/da/d69/classcv_1_1datasets_1_1OR__sun.html#a1645e733a08fa9e64d2375d946e3f2de',1,'cv::datasets::OR_sun::paths']]], - ['paths_190',['Paths',['https://docs.opencv.org/4.2.0/d3/dc4/namespacecv_1_1utils.html#a8a925b06bb0e09dede483e22333ad4dd',1,'cv::utils']]], - ['pattern_191',['pattern',['https://docs.opencv.org/4.2.0/da/d0d/tutorial_camera_calibration_pattern.html',1,'Create calibration pattern'],['https://docs.opencv.org/4.2.0/dd/db9/structcv_1_1GTransform.html#ad21c88ff36d3cb622e84df46cc06355c',1,'cv::GTransform::pattern']]], - ['pattern_20for_203d_20reconstruction_192',['Custom Calibration Pattern for 3D reconstruction',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html',1,'']]], - ['pattern_20tutorial_193',['pattern tutorial',['https://docs.opencv.org/4.2.0/db/d56/tutorial_capture_graycode_pattern.html',1,'Capture Gray code pattern tutorial'],['https://docs.opencv.org/4.2.0/d0/de8/tutorial_capture_sinusoidal_pattern.html',1,'Capture Sinusoidal pattern tutorial'],['https://docs.opencv.org/4.2.0/dc/da9/tutorial_decode_graycode_pattern.html',1,'Decode Gray code pattern tutorial']]], - ['pbackfail_194',['pbackfail',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'__gnu_cxx::enc_filebuf::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'__gnu_cxx::stdio_filebuf::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'__gnu_cxx::stdio_sync_filebuf::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'basic_filebuf< char_type, traits_type >::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'basic_streambuf< _Elem, _Tr >::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'basic_streambuf< char, _Traits >::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'basic_streambuf< char, char_traits< char > >::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'std::basic_filebuf::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'std::basic_streambuf::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'std::basic_stringbuf::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'std::wbuffer_convert::pbackfail()']]], - ['pbase_195',['pbase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'__gnu_cxx::enc_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'__gnu_cxx::enc_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'__gnu_cxx::stdio_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'__gnu_cxx::stdio_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'__gnu_cxx::stdio_sync_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'__gnu_cxx::stdio_sync_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_filebuf< char_type, traits_type >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_filebuf< char_type, traits_type >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_streambuf< _Elem, _Tr >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_streambuf< _Elem, _Tr >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_streambuf< char, _Traits >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_streambuf< char, _Traits >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_streambuf< char, char_traits< char > >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_streambuf< char, char_traits< char > >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::basic_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::basic_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::basic_streambuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::basic_streambuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::basic_stringbuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::basic_stringbuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::wbuffer_convert::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::wbuffer_convert::pbase() const']]], - ['pbu_196',['pBU',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a4e534c3211135d64f80e9d6bbb868c10',1,'NppStInterpolationState']]], - ['pbump_197',['pbump',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'__gnu_cxx::enc_filebuf::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'__gnu_cxx::stdio_filebuf::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'__gnu_cxx::stdio_sync_filebuf::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'basic_filebuf< char_type, traits_type >::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'basic_streambuf< _Elem, _Tr >::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'basic_streambuf< char, _Traits >::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'basic_streambuf< char, char_traits< char > >::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'std::basic_filebuf::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'std::basic_streambuf::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'std::basic_stringbuf::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'std::wbuffer_convert::pbump()']]], - ['pbv_198',['pBV',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a8e0864523bcefbf127909ea15398a4d1',1,'NppStInterpolationState']]], - ['pc_199',['pc',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a172ccaaba996db5201af1c17c04a5fe8a5c598dc317cfe6ac99afeaeed18454c7',1,'cv']]], - ['pca_200',['PCA',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'Introduction to Principal Component Analysis (PCA)'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html',1,'cv::PCA'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a50ad1a87273a258055a331d5a4c63ce4',1,'cv::PCA::PCA()'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a5a7400a3dd169deb4111231a61bc2575',1,'cv::PCA::PCA(InputArray data, InputArray mean, int flags, int maxComponents=0)'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#af44683b857883856418187f24d8d19a2',1,'cv::PCA::PCA(InputArray data, InputArray mean, int flags, double retainedVariance)']]], - ['pca_5flearning_5frate_201',['pca_learning_rate',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#afd3ead64571cd315b22948e0f1f2236f',1,'cv::TrackerKCF::Params']]], - ['pcabackproject_202',['PCABackProject',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab26049f30ee8e94f7d69d82c124faafc',1,'cv::PCABackProject()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab26049f30ee8e94f7d69d82c124faafc',1,'PCABackProject()(Global Namespace)']]], - ['pcacompute_203',['PCACompute',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga4e2073c7311f292a0648f04c37b73781',1,'cv::PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, int maxComponents=0)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga27a565b31d820b05dcbcd47112176b6e',1,'cv::PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, OutputArray eigenvalues, int maxComponents=0)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0ad1147fbcdb256f2e14ae2bfb8c991d',1,'cv::PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, double retainedVariance)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa928ce9ac86ffc12b7fae3a22a3aa308',1,'cv::PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, OutputArray eigenvalues, double retainedVariance)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga4e2073c7311f292a0648f04c37b73781',1,'PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, int maxComponents=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga27a565b31d820b05dcbcd47112176b6e',1,'PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, OutputArray eigenvalues, int maxComponents=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0ad1147fbcdb256f2e14ae2bfb8c991d',1,'PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, double retainedVariance)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa928ce9ac86ffc12b7fae3a22a3aa308',1,'PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, OutputArray eigenvalues, double retainedVariance)(Global Namespace)']]], - ['pcaflow_2ehpp_204',['pcaflow.hpp',['https://docs.opencv.org/4.2.0/dc/dee/pcaflow_8hpp.html',1,'']]], - ['pcaprior_205',['PCAPrior',['https://docs.opencv.org/4.2.0/d5/d5e/classcv_1_1optflow_1_1PCAPrior.html',1,'cv::optflow::PCAPrior'],['https://docs.opencv.org/4.2.0/d5/d5e/classcv_1_1optflow_1_1PCAPrior.html#a031a676ee478ca24025bece163c2c30f',1,'cv::optflow::PCAPrior::PCAPrior()']]], - ['pcaproject_206',['PCAProject',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6b9fbc7b3a99ebfd441bbec0a6bc4f88',1,'cv::PCAProject()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6b9fbc7b3a99ebfd441bbec0a6bc4f88',1,'PCAProject()(Global Namespace)']]], - ['pcibusid_207',['pciBusID',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a18cd51bd5df3d08c2c610b1b9a468d80',1,'cv::cuda::DeviceInfo']]], - ['pcideviceid_208',['pciDeviceID',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ace233d329eee91a016f682066aff170d',1,'cv::cuda::DeviceInfo']]], - ['pcidomainid_209',['pciDomainID',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8e6849afd47c911ca06c2ced22d369c7',1,'cv::cuda::DeviceInfo']]], - ['pctsignatures_210',['PCTSignatures',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html',1,'cv::xfeatures2d']]], - ['pctsignaturessqfd_211',['PCTSignaturesSQFD',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1xfeatures2d_1_1PCTSignaturesSQFD.html',1,'cv::xfeatures2d']]], - ['pd_212',['pd',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a3016479bf218847574f55b53d28ea2ea',1,'cv::dnn::DictValue']]], - ['pd_5fcaltech_213',['PD_caltech',['https://docs.opencv.org/4.2.0/da/d8d/classcv_1_1datasets_1_1PD__caltech.html',1,'cv::datasets']]], - ['pd_5fcaltech_2ehpp_214',['pd_caltech.hpp',['https://docs.opencv.org/4.2.0/dc/dc3/pd__caltech_8hpp.html',1,'']]], - ['pd_5fcaltechobj_215',['PD_caltechObj',['https://docs.opencv.org/4.2.0/dd/ded/structcv_1_1datasets_1_1PD__caltechObj.html',1,'cv::datasets']]], - ['pd_5finria_216',['PD_inria',['https://docs.opencv.org/4.2.0/d2/d61/classcv_1_1datasets_1_1PD__inria.html',1,'cv::datasets']]], - ['pd_5finria_2ehpp_217',['pd_inria.hpp',['https://docs.opencv.org/4.2.0/d2/de3/pd__inria_8hpp.html',1,'']]], - ['pd_5finriaobj_218',['PD_inriaObj',['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1datasets_1_1PD__inriaObj.html',1,'cv::datasets']]], - ['peakbitrate_219',['PeakBitrate',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a20377720033ff6ab820c3a16a58da753',1,'cv::cudacodec::EncoderParams']]], - ['pedestrian_20detection_220',['Pedestrian Detection',['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html',1,'']]], - ['peek_221',['peek',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'basic_iostream< char >::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'basic_iostream< char >::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'basic_istream< char >::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'basic_istream< char >::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'basic_istream< char, _Traits >::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'basic_istream< char, _Traits >::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_fstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_fstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_ifstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_ifstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_iostream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_iostream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_istream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_istream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_istringstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_istringstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_stringstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_stringstream::peek()']]], - ['peilin_2ehpp_222',['peilin.hpp',['https://docs.opencv.org/4.2.0/dd/db0/peilin_8hpp.html',1,'']]], - ['peilinnormalization_223',['PeiLinNormalization',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#ga50d064b92f63916f4162474eea22d656',1,'cv::ximgproc::PeiLinNormalization(InputArray I)'],['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#gaeef3f93a672fa5e3e20adbf6e5e32986',1,'cv::ximgproc::PeiLinNormalization(InputArray I, OutputArray T)'],['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#ga50d064b92f63916f4162474eea22d656',1,'PeiLinNormalization(InputArray I)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#gaeef3f93a672fa5e3e20adbf6e5e32986',1,'PeiLinNormalization(InputArray I, OutputArray T)(Global Namespace)']]], - ['pencilsketch_224',['pencilSketch',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#gae5930dd822c713b36f8529b21ddebd0c',1,'cv::pencilSketch()'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#gae5930dd822c713b36f8529b21ddebd0c',1,'pencilSketch(InputArray src, OutputArray dst1, OutputArray dst2, float sigma_s=60, float sigma_r=0.07f, float shade_factor=0.02f)(Global Namespace)']]], - ['per_20element_20operations_225',['Per-element Operations',['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html',1,'']]], - ['per_5felement_5ffunc_2ehpp_226',['per_element_func.hpp',['https://docs.opencv.org/4.2.0/dd/d7e/per__element__func_8hpp.html',1,'']]], - ['perceptual_20computing_20sdk_20compatible_20depth_20sensors_227',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], - ['perform_5fmorphing_228',['perform_morphing',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#a56f152a6180a2c0283a708166b1aed9d',1,'cv::cuda::FGDParams']]], - ['performance_20measurement_20and_20improvement_20techniques_229',['Performance Measurement and Improvement Techniques',['https://docs.opencv.org/4.2.0/dc/d71/tutorial_py_optimization.html',1,'']]], - ['performsegmentcpu_230',['performSegmentCpu',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#a53fac3e2d612a11a71c10d196ab94e4b',1,'cv::hfs::HfsSegment']]], - ['performsegmentgpu_231',['performSegmentGpu',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#a5a7ebdd324113f4fefcd246bbb5d90ce',1,'cv::hfs::HfsSegment']]], - ['perimeter_232',['perimeter',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a94ebcd24d58d1274a9a269bb55fb13dc',1,'cv::text::ERStat']]], - ['period_233',['period',['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html#a749ab7956a5fdb5833c2fd3b44c17275',1,'cv::videostab::MoreAccurateMotionWobbleSuppressorBase']]], - ['period_5f_234',['period_',['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html#a4ce79a10a75561b24a9ca7722c804ea4',1,'cv::videostab::MoreAccurateMotionWobbleSuppressorBase']]], - ['periodic_20noise_20removing_20filter_235',['Periodic Noise Removing Filter',['https://docs.opencv.org/4.2.0/d2/d0b/tutorial_periodic_noise_removing_filter.html',1,'']]], - ['periodic_5fnoise_5fremoving_5ffilter_2emarkdown_236',['periodic_noise_removing_filter.markdown',['https://docs.opencv.org/4.2.0/db/d31/periodic__noise__removing__filter_8markdown.html',1,'']]], - ['periodicscheduler_237',['PeriodicScheduler',['../classutil_1_1PeriodicScheduler.html',1,'util::PeriodicScheduler< Clock >'],['../classutil_1_1PeriodicScheduler.html#a6d7b387f9a7743b601aca004c7524d08',1,'util::PeriodicScheduler::PeriodicScheduler()']]], - ['periodicscheduler_3c_20std_3a_3achrono_3a_3asteady_5fclock_20_3e_238',['PeriodicScheduler< std::chrono::steady_clock >',['../classutil_1_1PeriodicScheduler.html',1,'util']]], - ['periodictask_239',['PeriodicTask',['../classutil_1_1PeriodicTask.html',1,'util::PeriodicTask< Clock >'],['../classutil_1_1PeriodicTask.html#ab7bcb7de2b55ab8cdb3fb48dccb9c229',1,'util::PeriodicTask::PeriodicTask()']]], - ['perms_240',['perms',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145',1,]]], - ['permutationbase_241',['PermutationBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html',1,'Eigen']]], - ['permutationbase_3c_20map_3c_20permutationmatrix_3c_20sizeatcompiletime_2c_20maxsizeatcompiletime_2c_20_5fstorageindex_20_3e_2c_20_5fpacketaccess_20_3e_20_3e_242',['PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html',1,'']]], - ['permutationbase_3c_20permutationmatrix_3c_20sizeatcompiletime_2c_20maxsizeatcompiletime_2c_20_5fstorageindex_20_3e_20_3e_243',['PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html',1,'']]], - ['permutationbase_3c_20permutationmatrix_3c_20sizeatcompiletime_2c_20maxsizeatcompiletime_2c_20storageindex_20_3e_20_3e_244',['PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html',1,'']]], - ['permutationbase_3c_20permutationwrapper_3c_20_5findicestype_20_3e_20_3e_245',['PermutationBase< PermutationWrapper< _IndicesType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html',1,'']]], - ['permutationmatrix_246',['PermutationMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html',1,'Eigen::PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a204b8bbba3c4d33c1a24bb60ad72b202',1,'Eigen::PermutationMatrix::PermutationMatrix(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a7ae7016a606b08573013115dcf2e56f2',1,'Eigen::PermutationMatrix::PermutationMatrix(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a0b9a4e51bea9c778a38f6e89db484af4',1,'Eigen::PermutationMatrix::PermutationMatrix(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aea29eab1fd6a6562971db7b9c04c11aa',1,'Eigen::PermutationMatrix::PermutationMatrix(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a204b8bbba3c4d33c1a24bb60ad72b202',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::PermutationMatrix(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a7ae7016a606b08573013115dcf2e56f2',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::PermutationMatrix(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a0b9a4e51bea9c778a38f6e89db484af4',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::PermutationMatrix(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aea29eab1fd6a6562971db7b9c04c11aa',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::PermutationMatrix(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a204b8bbba3c4d33c1a24bb60ad72b202',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::PermutationMatrix(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a7ae7016a606b08573013115dcf2e56f2',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::PermutationMatrix(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a0b9a4e51bea9c778a38f6e89db484af4',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::PermutationMatrix(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aea29eab1fd6a6562971db7b9c04c11aa',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::PermutationMatrix(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a204b8bbba3c4d33c1a24bb60ad72b202',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::PermutationMatrix(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a7ae7016a606b08573013115dcf2e56f2',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::PermutationMatrix(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a0b9a4e51bea9c778a38f6e89db484af4',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::PermutationMatrix(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aea29eab1fd6a6562971db7b9c04c11aa',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::PermutationMatrix(Index size)']]], - ['permutationmatrix_3c_20colsatcompiletime_2c_20maxcolsatcompiletime_20_3e_247',['PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html',1,'']]], - ['permutationmatrix_3c_20dynamic_2c_20dynamic_2c_20storageindex_20_3e_248',['PermutationMatrix< Dynamic, Dynamic, StorageIndex >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html',1,'']]], - ['permutationmatrix_3c_20rowsatcompiletime_2c_20maxrowsatcompiletime_20_3e_249',['PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html',1,'']]], - ['permutationp_250',['permutationP',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#ad8f1d7266a434c524d3e0dbcc7a0f588',1,'Eigen::FullPivLU::permutationP()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a0d52cec5e17f485a362766363ba90b02',1,'Eigen::IncompleteCholesky::permutationP()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a1c637530b3215787668a75ebb2e7b882',1,'Eigen::PartialPivLU::permutationP()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html#aff1480e595a21726beaec9a586a94d5a',1,'Eigen::SimplicialCholeskyBase::permutationP() const']]], - ['permutationpinv_251',['permutationPinv',['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html#a0e23d1f4a88c211be7098faf1cb41674',1,'Eigen::SimplicialCholeskyBase']]], - ['permutationq_252',['permutationQ',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a8d18190c7618de271cba7293f0493a36',1,'Eigen::FullPivLU']]], - ['permutationstorage_253',['PermutationStorage',['https://eigen.tuxfamily.org/dox/structEigen_1_1PermutationStorage.html',1,'Eigen']]], - ['permutationwrapper_254',['PermutationWrapper',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationWrapper.html',1,'Eigen']]], - ['permutelayer_255',['PermuteLayer',['https://docs.opencv.org/4.2.0/d2/d3c/classcv_1_1dnn_1_1PermuteLayer.html',1,'cv::dnn']]], - ['persistence_256',['XML/YAML Persistence',['https://docs.opencv.org/4.2.0/d4/da4/group__core__xml.html',1,'']]], - ['persistence_2ehpp_257',['persistence.hpp',['https://docs.opencv.org/4.2.0/d8/d14/persistence_8hpp.html',1,'']]], - ['person_258',['person',['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#a2d5afac17806cdb1ed13943f06be54a3',1,'cv::datasets::GR_skigObj::person'],['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#af3f958ba916e0d2ae312fcb0c369dffd',1,'cv::datasets::HPE_humanevaObj::person']]], - ['perspectivemap_259',['perspectiveMap',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d9fb685753febcac788c82f2375f45c',1,'cv::cudev::perspectiveMap()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d9fb685753febcac788c82f2375f45c',1,'perspectiveMap()(Global Namespace)']]], - ['perspectivemapptr_260',['PerspectiveMapPtr',['https://docs.opencv.org/4.2.0/df/d20/structcv_1_1cudev_1_1PerspectiveMapPtr.html',1,'cv::cudev']]], - ['perspectivemapptrsz_261',['PerspectiveMapPtrSz',['https://docs.opencv.org/4.2.0/de/d6d/structcv_1_1cudev_1_1PerspectiveMapPtrSz.html',1,'cv::cudev']]], - ['perspectiveremoveignoredmarginpercell_262',['perspectiveRemoveIgnoredMarginPerCell',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a2a01a662bf4718fe689d0fe23ddec69e',1,'cv::aruco::DetectorParameters']]], - ['perspectiveremovepixelpercell_263',['perspectiveRemovePixelPerCell',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a1feac9bd1d3ae9bc1cc48bcf900cf25d',1,'cv::aruco::DetectorParameters']]], - ['perspectivetransform_264',['perspectiveTransform',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad327659ac03e5fd6894b90025e6900a7',1,'cv::perspectiveTransform()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad327659ac03e5fd6894b90025e6900a7',1,'perspectiveTransform()(Global Namespace)']]], - ['pframe_265',['PFRAME',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1cudacodec_1_1EncoderCallBack.html#a438ff7f710203a94e60577c9f4a70843a5437d1ba1602eaed5049c81b18dd1472',1,'cv::cudacodec::EncoderCallBack']]], - ['pfu_266',['pFU',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a3ee911c6f9e2e3a135aaf80a072a0f5f',1,'NppStInterpolationState']]], - ['pfv_267',['pFV',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#acdf5a39b936be5ea5242700948615170',1,'NppStInterpolationState']]], - ['phase_268',['phase',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9db9ca9b4d81c3bde5677b8f64dc0137',1,'cv::phase()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga5b75ec01be06dcd6e27ada09a0d4656a',1,'cv::cuda::phase()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga3c98a8ad1054d296500220737c04d18c',1,'cv::gapi::phase()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9db9ca9b4d81c3bde5677b8f64dc0137',1,'phase(InputArray x, InputArray y, OutputArray angle, bool angleInDegrees=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga3c98a8ad1054d296500220737c04d18c',1,'phase(const GMat &x, const GMat &y, bool angleInDegrees=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga5b75ec01be06dcd6e27ada09a0d4656a',1,'phase(InputArray x, InputArray y, OutputArray angle, bool angleInDegrees=false, Stream &stream=Stream::Null())(Global Namespace)']]], - ['phase_20maps_269',['Unwrap two-dimensional phase maps',['https://docs.opencv.org/4.2.0/d9/dfb/tutorial_unwrap.html',1,'']]], - ['phase_20unwrapping_20api_270',['Phase Unwrapping API',['https://docs.opencv.org/4.2.0/df/d3a/group__phase__unwrapping.html',1,'']]], - ['phase_20unwrapping_20tutorial_271',['Phase Unwrapping tutorial',['https://docs.opencv.org/4.2.0/db/d74/tutorial_unwrap_phase_map.html',1,'']]], - ['phase_5funwrapping_2ehpp_272',['phase_unwrapping.hpp',['https://docs.opencv.org/4.2.0/d3/d22/phase__unwrapping_2phase__unwrapping_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/dee/phase__unwrapping_8hpp.html',1,'(Global Namespace)']]], - ['phase_5funwrapping_2emarkdown_273',['phase_unwrapping.markdown',['https://docs.opencv.org/4.2.0/d9/dac/phase__unwrapping_8markdown.html',1,'']]], - ['phasecorrelate_274',['phaseCorrelate',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html#ga552420a2ace9ef3fb053cd630fdb4952',1,'cv::phaseCorrelate()'],['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html#ga552420a2ace9ef3fb053cd630fdb4952',1,'phaseCorrelate()(Global Namespace)']]], - ['phaseunwrapping_275',['PhaseUnwrapping',['https://docs.opencv.org/4.2.0/d8/d83/classcv_1_1phase__unwrapping_1_1PhaseUnwrapping.html',1,'cv::phase_unwrapping']]], - ['phash_276',['PHash',['https://docs.opencv.org/4.2.0/df/d4e/classcv_1_1img__hash_1_1PHash.html',1,'cv::img_hash::PHash'],['https://docs.opencv.org/4.2.0/df/d4e/classcv_1_1img__hash_1_1PHash.html#a0635c8648c41b81c318ba248713e8a61',1,'cv::img_hash::PHash::PHash()']]], - ['phash_277',['pHash',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga5eeee1e27bc45caffe3b529ab42568e3',1,'cv::img_hash::pHash()'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga5eeee1e27bc45caffe3b529ab42568e3',1,'pHash(cv::InputArray inputArr, cv::OutputArray outputArr)(Global Namespace)']]], - ['phash_2ehpp_278',['phash.hpp',['https://docs.opencv.org/4.2.0/d1/d9c/phash_8hpp.html',1,'']]], - ['photo_20module_279',['Computational photography (photo module)',['https://docs.opencv.org/4.2.0/da/de7/tutorial_table_of_content_photo.html',1,'']]], - ['photo_20processing_20algorithms_280',['Additional photo processing algorithms',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html',1,'']]], - ['photo_2ehpp_281',['photo.hpp',['https://docs.opencv.org/4.2.0/d1/d1f/photo_2photo_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d81/photo_8hpp.html',1,'(Global Namespace)']]], - ['photocamera_3acapturedimage_3a_282',['photoCamera:capturedImage:',['https://docs.opencv.org/4.2.0/d7/d2f/protocolCvPhotoCameraDelegate_01-p.html#acf24bf3ba072058ad5a3bd3dcfad3a96',1,'CvPhotoCameraDelegate -p-p']]], - ['photocameracancel_3a_283',['photoCameraCancel:',['https://docs.opencv.org/4.2.0/d7/d2f/protocolCvPhotoCameraDelegate_01-p.html#a18228a5d5c588f2824e91b8cf0d546ca',1,'CvPhotoCameraDelegate -p-p']]], - ['photography_284',['Photography',['https://docs.opencv.org/4.2.0/d1/d0d/group__photo.html',1,'Computational Photography'],['https://docs.opencv.org/4.2.0/d0/d07/tutorial_py_table_of_contents_photo.html',1,'Computational Photography']]], - ['photography_20photo_20module_285',['Computational photography (photo module)',['https://docs.opencv.org/4.2.0/da/de7/tutorial_table_of_content_photo.html',1,'']]], - ['photoindex_286',['photoIndex',['https://docs.opencv.org/4.2.0/df/db0/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1edge.html#a222d0adffc07a280157383418a18c7a2',1,'cv::multicalib::MultiCameraCalibration::edge']]], - ['photorealistic_20rendering_287',['Non-Photorealistic Rendering',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html',1,'']]], - ['photoreceptorslocaladaptationsensitivity_288',['photoreceptorsLocalAdaptationSensitivity',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#aa943e6eafdbbeb33212199959ae251c1',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], - ['photoreceptorsspatialconstant_289',['photoreceptorsSpatialConstant',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#a5505c985b200b504bd33e7b2d63866de',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], - ['photoreceptorstemporalconstant_290',['photoreceptorsTemporalConstant',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#a1e49259e54240a826c1a38bc7a1a4c98',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], - ['photovertex_291',['photoVertex',['https://docs.opencv.org/4.2.0/df/db0/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1edge.html#a785901522deb1b419a07c2d36db9d3e3',1,'cv::multicalib::MultiCameraCalibration::edge']]], - ['pi_292',['pi',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a50aada98f5b380f4705dd9c09b5ddf7c',1,'cv::dnn::DictValue::pi'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga41255205b005025756f29372d0ad8cb3',1,'cv::softdouble::pi()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabd90e5aaea95a7ae582cc34e830fcb5e',1,'cv::softfloat::pi()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabd90e5aaea95a7ae582cc34e830fcb5e',1,'pi()(Global Namespace)']]], - ['pictype_293',['PicType',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1cudacodec_1_1EncoderCallBack.html#a438ff7f710203a94e60577c9f4a70843',1,'cv::cudacodec::EncoderCallBack']]], - ['pidcoef_5ft_294',['pidcoef_t',['../structrobot_1_1pidcoef__t.html',1,'robot']]], - ['pidcontroller_295',['PIDController',['../classcontrol_1_1PIDController.html',1,'control::PIDController< dim >'],['../classcontrol_1_1PIDController.html#ad88305ead74b819e1545be3d8fcf7c28',1,'control::PIDController::PIDController()']]], - ['pidgains_296',['PIDGains',['../structcontrol_1_1PIDGains.html',1,'control']]], - ['pidmotors_297',['pidMotors',['../namespacerobot.html#a98f16731da8ac7f980fe19c12aa3a4f8',1,'robot']]], - ['piecewise_5fconstant_5fdistribution_298',['piecewise_constant_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html',1,'std']]], - ['piecewise_5fconstruct_299',['piecewise_construct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga4be4b722e942cd646f19614bcff7a328',1,'std::piecewise_construct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga4be4b722e942cd646f19614bcff7a328',1,'piecewise_construct(Global Namespace)']]], - ['piecewise_5fconstruct_5ft_300',['piecewise_construct_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07783.html',1,'std']]], - ['piecewise_5flinear_5fdistribution_301',['piecewise_linear_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html',1,'std']]], - ['pimpl_302',['pImpl',['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1img__hash_1_1ImgHashBase.html#a3a6b4cc6dd3279018cefdf240c93e99c',1,'cv::img_hash::ImgHashBase']]], - ['pinhole_303',['PINHOLE',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#ab2a2522a8e0bf60ee24416e0ec37ba3ea833498d4f66baf027a178b9d299cf46b',1,'cv::multicalib::MultiCameraCalibration']]], - ['pink_304',['pink',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a2bb7ce663f58eeae244dc2c4c460eeaa',1,'cv::viz::Color']]], - ['pipeline_305',['Simple Pipeline',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html',1,'']]], - ['pipeline_20with_20g_20api_306',['Face analytics pipeline with G-API',['https://docs.opencv.org/4.2.0/d8/d24/tutorial_gapi_interactive_face_detection.html',1,'']]], - ['pitch_307',['pitch',['../structkinematics_1_1jointpos__t.html#ad11455e400c0db0d05eaab13f1d369c6',1,'kinematics::jointpos_t::pitch'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#afe2cc277372b013c0a58a40e42ae8a88',1,'NCVMatrix::pitch()']]], - ['pitfalls_308',['Common pitfalls',['https://eigen.tuxfamily.org/dox/TopicPitfalls.html',1,'']]], - ['pixel_309',['pixel',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#adba2ef41119cfbb88742c646ee2e5d19',1,'cv::text::ERStat']]], - ['pixel_5fpack_5fbuffer_310',['PIXEL_PACK_BUFFER',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a830568a629457171cb07918537ec66bea04aec232cc3ac3070953ba669bee3a3a',1,'cv::ogl::Buffer']]], - ['pixel_5funpack_5fbuffer_311',['PIXEL_UNPACK_BUFFER',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a830568a629457171cb07918537ec66bea882899bdc22e1c13618c294343d4d9dc',1,'cv::ogl::Buffer']]], - ['pixels_312',['pixels',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a4ac2c208273f2d37ad1dbc22a877ebe7',1,'cv::text::ERStat']]], - ['pixelwise_20operations_313',['Graph API: Pixelwise operations',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html',1,'']]], - ['pkg_314',['pkg',['https://docs.opencv.org/4.2.0/d6/d25/structcv_1_1gapi_1_1use__only.html#ab88387d52737d3f54ffd774ced70a840',1,'cv::gapi::use_only']]], - ['plaidml_315',['plaidml',['https://docs.opencv.org/4.2.0/da/d9f/namespaceplaidml.html',1,'']]], - ['plaidml_2ehpp_316',['plaidml.hpp',['https://docs.opencv.org/4.2.0/dc/dd8/plaidml_8hpp.html',1,'']]], - ['plaidml_3a_3aedsl_317',['edsl',['https://docs.opencv.org/4.2.0/d0/da9/namespaceplaidml_1_1edsl.html',1,'plaidml']]], - ['plaidml_5fget_5fin_318',['plaidml_get_in',['https://docs.opencv.org/4.2.0/de/dc5/structcv_1_1detail_1_1plaidml__get__in.html',1,'cv::detail']]], - ['plaidml_5fget_5fin_3c_20cv_3a_3agmat_20_3e_319',['plaidml_get_in< cv::GMat >',['https://docs.opencv.org/4.2.0/dc/dc6/structcv_1_1detail_1_1plaidml__get__in_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], - ['plaidml_5fget_5fout_320',['plaidml_get_out',['https://docs.opencv.org/4.2.0/dd/d66/structcv_1_1detail_1_1plaidml__get__out.html',1,'cv::detail']]], - ['plaidml_5fget_5fout_3c_20cv_3a_3agmat_20_3e_321',['plaidml_get_out< cv::GMat >',['https://docs.opencv.org/4.2.0/db/dc2/structcv_1_1detail_1_1plaidml__get__out_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], - ['plaidmlcallhelper_322',['PlaidMLCallHelper',['https://docs.opencv.org/4.2.0/db/da8/structcv_1_1detail_1_1PlaidMLCallHelper.html',1,'cv::detail']]], - ['plaidmlcallhelper_3c_20impl_2c_20k_3a_3ainargs_2c_20k_3a_3aoutargs_20_3e_323',['PlaidMLCallHelper< Impl, K::InArgs, K::OutArgs >',['https://docs.opencv.org/4.2.0/db/da8/structcv_1_1detail_1_1PlaidMLCallHelper.html',1,'']]], - ['plaidmlcallhelper_3c_20impl_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20outs_2e_2e_2e_20_3e_20_3e_324',['PlaidMLCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... > >',['https://docs.opencv.org/4.2.0/d3/d9b/structcv_1_1detail_1_1PlaidMLCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_136b8b4137b37f2f9fd90a73d3a1d6da6.html',1,'cv::detail']]], - ['plainarray_325',['PlainArray',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65328b7d6fc10a26ff6cd5801a6a44eb',1,'Eigen::DenseBase::PlainArray'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65328b7d6fc10a26ff6cd5801a6a44eb',1,'DenseBase< ArrayWrapper< ExpressionType > >::PlainArray'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65328b7d6fc10a26ff6cd5801a6a44eb',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::PlainArray'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65328b7d6fc10a26ff6cd5801a6a44eb',1,'DenseBase< Solve< Decomposition, RhsType > >::PlainArray']]], - ['plainmatrix_326',['PlainMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa301ef39d63443e9ef0b84f47350116e',1,'Eigen::DenseBase::PlainMatrix'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa301ef39d63443e9ef0b84f47350116e',1,'DenseBase< ArrayWrapper< ExpressionType > >::PlainMatrix'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa301ef39d63443e9ef0b84f47350116e',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::PlainMatrix'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa301ef39d63443e9ef0b84f47350116e',1,'DenseBase< Solve< Decomposition, RhsType > >::PlainMatrix']]], - ['plainobject_327',['PlainObject',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aae45af9b5aca5a9caae98fd201f47cc4',1,'Eigen::DenseBase::PlainObject'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aae45af9b5aca5a9caae98fd201f47cc4',1,'DenseBase< ArrayWrapper< ExpressionType > >::PlainObject'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aae45af9b5aca5a9caae98fd201f47cc4',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::PlainObject'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aae45af9b5aca5a9caae98fd201f47cc4',1,'DenseBase< Solve< Decomposition, RhsType > >::PlainObject']]], - ['plainobjectbase_328',['PlainObjectBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen::PlainObjectBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'Eigen::PlainObjectBase::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'Eigen::PlainObjectBase::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'Eigen::PlainObjectBase::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'Eigen::PlainObjectBase::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'Eigen::PlainObjectBase::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'Eigen::PlainObjectBase::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)']]], - ['plainobjectbase_3c_20array_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_329',['PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], - ['plainobjectbase_3c_20array_3c_20double_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_330',['PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], - ['plainobjectbase_3c_20array_3c_20index_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_331',['PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], - ['plainobjectbase_3c_20array_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_332',['PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], - ['plainobjectbase_3c_20array_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_333',['PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], - ['plainobjectbase_3c_20array_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_334',['PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], - ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_335',['PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], - ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20outputdim_2c_20outputdim_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_336',['PlainObjectBase< Matrix< _Scalar, outputDim, outputDim, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen']]], - ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20outputdim_2c_20statedim_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_337',['PlainObjectBase< Matrix< _Scalar, outputDim, stateDim, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen']]], - ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20statedim_2c_201_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_338',['PlainObjectBase< Matrix< _Scalar, stateDim, 1, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen']]], - ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20statedim_2c_20inputdim_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_339',['PlainObjectBase< Matrix< _Scalar, stateDim, inputDim, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen']]], - ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20statedim_2c_20outputdim_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_340',['PlainObjectBase< Matrix< _Scalar, stateDim, outputDim, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen']]], - ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20statedim_2c_20statedim_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_341',['PlainObjectBase< Matrix< _Scalar, stateDim, stateDim, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen']]], - ['plainobjectbase_3c_20matrix_3c_20complexscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_342',['PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], - ['plainobjectbase_3c_20matrix_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_343',['PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], - ['plainobjectbase_3c_20matrix_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_344',['PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], - ['plainobjectbase_3c_20matrix_3c_20scalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_345',['PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], - ['plainobjectbase_3c_20matrix_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_346',['PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], - ['planar_347',['planar',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a7618c7c08cd282071e295a93080ef035',1,'cv::GMatDesc']]], - ['planar_20objects_348',['Detection of planar objects',['https://docs.opencv.org/4.2.0/dd/dd4/tutorial_detection_of_planar_objects.html',1,'']]], - ['planar_20subdivision_349',['Planar Subdivision',['https://docs.opencv.org/4.2.0/df/d5b/group__imgproc__subdiv2d.html',1,'']]], - ['planar_20tracking_350',['AKAZE and ORB planar tracking',['https://docs.opencv.org/4.2.0/dc/d16/tutorial_akaze_tracking.html',1,'']]], - ['planararmcontroller_351',['PlanarArmController',['../classcontrol_1_1PlanarArmController.html',1,'control::PlanarArmController< N >'],['../classcontrol_1_1PlanarArmController.html#a576de65dc6da492f2f2323b6b582b070',1,'control::PlanarArmController::PlanarArmController(const kinematics::ArmKinematics< 2, N > &kin_obj, const double safetyFactor)'],['../classcontrol_1_1PlanarArmController.html#ae78d49de1c594c3b18c1ec2adcdf6f8a',1,'control::PlanarArmController::PlanarArmController(PlanarArmController &&other)']]], - ['planararmfk_352',['PlanarArmFK',['../classkinematics_1_1PlanarArmFK.html',1,'kinematics::PlanarArmFK< N >'],['../classkinematics_1_1PlanarArmFK.html#aecc2f6c7b6efe51acc76d452b634325a',1,'kinematics::PlanarArmFK::PlanarArmFK()']]], - ['planeportraitprojector_353',['PlanePortraitProjector',['https://docs.opencv.org/4.2.0/df/d0d/structcv_1_1detail_1_1PlanePortraitProjector.html',1,'cv::detail']]], - ['planeportraitwarper_354',['PlanePortraitWarper',['https://docs.opencv.org/4.2.0/d9/d77/classcv_1_1detail_1_1PlanePortraitWarper.html',1,'cv::detail::PlanePortraitWarper'],['https://docs.opencv.org/4.2.0/d9/d77/classcv_1_1detail_1_1PlanePortraitWarper.html#ac710a564bf0b02738a9ea62914d31c10',1,'cv::detail::PlanePortraitWarper::PlanePortraitWarper()']]], - ['planeprojector_355',['PlaneProjector',['https://docs.opencv.org/4.2.0/d6/d1f/structcv_1_1detail_1_1PlaneProjector.html',1,'cv::detail']]], - ['planes_356',['planes',['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#add8eb6b9303aeed6dccd8a57809b6260',1,'cv::NAryMatIterator']]], - ['planewarper_357',['PlaneWarper',['https://docs.opencv.org/4.2.0/d3/d3d/classcv_1_1detail_1_1PlaneWarper.html',1,'cv::detail::PlaneWarper'],['https://docs.opencv.org/4.2.0/d0/d57/classcv_1_1PlaneWarper.html',1,'cv::PlaneWarper'],['https://docs.opencv.org/4.2.0/d3/d3d/classcv_1_1detail_1_1PlaneWarper.html#aa2ad12b1558467a7efd9763210067726',1,'cv::detail::PlaneWarper::PlaneWarper()']]], - ['planewarpergpu_358',['PlaneWarperGpu',['https://docs.opencv.org/4.2.0/d2/d1a/classcv_1_1detail_1_1PlaneWarperGpu.html',1,'cv::detail::PlaneWarperGpu'],['https://docs.opencv.org/4.2.0/d2/d1a/classcv_1_1detail_1_1PlaneWarperGpu.html#a22a65f53d44635868c9d7c3fd2e8a676',1,'cv::detail::PlaneWarperGpu::PlaneWarperGpu()']]], - ['platform_359',['Platform',['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html',1,'cv::ocl::Platform'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#a15264d2fcab82e296e46418c783144f5',1,'cv::ocl::Platform::Platform()'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#a0af32b909ddf12194505e1c7caf1960b',1,'cv::ocl::Platform::Platform(const Platform &p)']]], - ['platforminfo_360',['PlatformInfo',['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html',1,'cv::ocl::PlatformInfo'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#a16992a45eda7745828254c0aed74d843',1,'cv::ocl::PlatformInfo::PlatformInfo()'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#ae50bb580fd5041a48f0241821adecd73',1,'cv::ocl::PlatformInfo::PlatformInfo(void *id)'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#ac1cc4c6aa05ff9e3e914cb52a3c02be1',1,'cv::ocl::PlatformInfo::PlatformInfo(const PlatformInfo &i)']]], - ['playentityanimation_361',['playEntityAnimation',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a4cfc8f8d671e0cc37686ff34db0ddaa5',1,'cv::ovis::WindowScene']]], - ['plot_20analyze_362',['Plot Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], - ['plot_20function_20for_20mat_20data_363',['Plot function for Mat data',['https://docs.opencv.org/4.2.0/db/dfe/group__plot.html',1,'']]], - ['plot_2ehpp_364',['plot.hpp',['https://docs.opencv.org/4.2.0/dc/dc0/plot_8hpp.html',1,'']]], - ['plot2d_365',['Plot2d',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html',1,'cv::plot']]], - ['plugin_20cdt_366',['Using OpenCV with Eclipse (plugin CDT)',['https://docs.opencv.org/4.2.0/d7/d16/tutorial_linux_eclipse.html',1,'']]], - ['plugins_367',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], - ['plus_368',['plus',['https://docs.opencv.org/4.2.0/d4/dd0/structcv_1_1cudev_1_1plus.html',1,'cv::cudev::plus< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07355.html',1,'std::plus< class >']]], - ['plusdelta_369',['plusDelta',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a364babc688c58ba62ea0cad61a65f07b',1,'cv::LineIterator']]], - ['plusstep_370',['plusStep',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#adb7f1c0c3e722d9e87230b92e7b9f773',1,'cv::LineIterator']]], - ['pnewframe_371',['pNewFrame',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#ae8166442221b4a0c8e165e28df97de98',1,'NppStInterpolationState']]], - ['pnorm_372',['pnorm',['https://docs.opencv.org/4.2.0/dc/df8/classcv_1_1dnn_1_1NormalizeBBoxLayer.html#a3b07f3df5e36c8909fb444bb512614f5',1,'cv::dnn::NormalizeBBoxLayer']]], - ['pnsr_20and_20ssim_20on_20the_20gpu_373',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], - ['pod_5fchar_5ftraits_2eh_374',['pod_char_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01067.html',1,'']]], - ['point_375',['Point',['https://docs.opencv.org/4.2.0/d4/dd6/classcv_1_1gapi_1_1own_1_1Point.html',1,'cv::gapi::own::Point'],['https://docs.opencv.org/4.2.0/d4/dd6/classcv_1_1gapi_1_1own_1_1Point.html#a780e84b7451bd70073cd3b1e5990ef2f',1,'cv::gapi::own::Point::Point()=default'],['https://docs.opencv.org/4.2.0/d4/dd6/classcv_1_1gapi_1_1own_1_1Point.html#ad16b16171e1478ac547a9175ea2b293c',1,'cv::gapi::own::Point::Point(int _x, int _y)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1e83eafb2d26b3c93f09e8338bcab192',1,'cv::Point'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1e83eafb2d26b3c93f09e8338bcab192',1,'Point(Global Namespace)']]], - ['point_20arithmetic_376',['Decimal Floating-Point Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01520.html',1,'']]], - ['point_20polygon_20test_377',['Point Polygon Test',['https://docs.opencv.org/4.2.0/dc/d48/tutorial_point_polygon_test.html',1,'']]], - ['point2d_378',['Point2d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga32986d8c6fd05949688352abd112509f',1,'cv::Point2d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga32986d8c6fd05949688352abd112509f',1,'Point2d(Global Namespace)']]], - ['point2f_379',['Point2f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7d080aa40de011e4410bca63385ffe2a',1,'cv::Point2f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7d080aa40de011e4410bca63385ffe2a',1,'Point2f(Global Namespace)']]], - ['point2i_380',['Point2i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0f70b52f0c0b119f7ed2448ffebdc144',1,'cv::Point2i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0f70b52f0c0b119f7ed2448ffebdc144',1,'Point2i(Global Namespace)']]], - ['point2l_381',['Point2l',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2f6c21f7cbd3a08bfc6467fd20df2f7e',1,'cv::Point2l'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2f6c21f7cbd3a08bfc6467fd20df2f7e',1,'Point2l(Global Namespace)']]], - ['point3_5f_382',['Point3_',['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html',1,'cv::Point3_< _Tp >'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a9e4715523bb9b888741fd72d2b21b003',1,'cv::Point3_::Point3_()'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a41a67894b57b08f9e944b845d2da007a',1,'cv::Point3_::Point3_(_Tp _x, _Tp _y, _Tp _z)'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#adff6a4bdbf71b83020d60a98765c022c',1,'cv::Point3_::Point3_(const Point3_ &pt)'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a6b2fe9e24c2ecdf0a288af15a187bbee',1,'cv::Point3_::Point3_(Point3_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a3c76e74b2393c19cef8f6c0ecd292241',1,'cv::Point3_::Point3_(const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a4ce6bcc3138662a2b4abb589120b25fb',1,'cv::Point3_::Point3_(const Vec< _Tp, 3 > &v)']]], - ['point3d_383',['Point3d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga17f8af95b76535bd387f4909850c8810',1,'cv::Point3d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga17f8af95b76535bd387f4909850c8810',1,'Point3d(Global Namespace)']]], - ['point3f_384',['Point3f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3d79ceeb4419bccd0308dfdf1cd31435',1,'cv::Point3f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3d79ceeb4419bccd0308dfdf1cd31435',1,'Point3f(Global Namespace)']]], - ['point3i_385',['Point3i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gac4ae8f2fb37ecb4b5d9268f17e46a18e',1,'cv::Point3i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gac4ae8f2fb37ecb4b5d9268f17e46a18e',1,'Point3i(Global Namespace)']]], - ['point_5f_386',['Point_',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'cv::Point_< _Tp >'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a415ac41e8676210b06bcfaf23d7e6105',1,'cv::Point_::Point_()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a8db927bb4ec0aa348367566cb6219c0f',1,'cv::Point_::Point_(_Tp _x, _Tp _y)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a58704d8c14d03c1fc738d87f6bf3d35c',1,'cv::Point_::Point_(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#afdc45cc80e589ff60b842782569f9304',1,'cv::Point_::Point_(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3d82eb725fc94c259b4467db3eb2f17c',1,'cv::Point_::Point_(const Size_< _Tp > &sz)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a60730a6fd845368d2323f62a186d8fe7',1,'cv::Point_::Point_(const Vec< _Tp, 2 > &v)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a415ac41e8676210b06bcfaf23d7e6105',1,'Point_< double >::Point_()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a8db927bb4ec0aa348367566cb6219c0f',1,'Point_< double >::Point_(double _x, double _y)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a58704d8c14d03c1fc738d87f6bf3d35c',1,'Point_< double >::Point_(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#afdc45cc80e589ff60b842782569f9304',1,'Point_< double >::Point_(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3d82eb725fc94c259b4467db3eb2f17c',1,'Point_< double >::Point_(const Size_< double > &sz)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a60730a6fd845368d2323f62a186d8fe7',1,'Point_< double >::Point_(const Vec< double, 2 > &v)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a415ac41e8676210b06bcfaf23d7e6105',1,'Point_< float >::Point_()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a8db927bb4ec0aa348367566cb6219c0f',1,'Point_< float >::Point_(float _x, float _y)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a58704d8c14d03c1fc738d87f6bf3d35c',1,'Point_< float >::Point_(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#afdc45cc80e589ff60b842782569f9304',1,'Point_< float >::Point_(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3d82eb725fc94c259b4467db3eb2f17c',1,'Point_< float >::Point_(const Size_< float > &sz)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a60730a6fd845368d2323f62a186d8fe7',1,'Point_< float >::Point_(const Vec< float, 2 > &v)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a415ac41e8676210b06bcfaf23d7e6105',1,'Point_< int >::Point_()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a8db927bb4ec0aa348367566cb6219c0f',1,'Point_< int >::Point_(int _x, int _y)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a58704d8c14d03c1fc738d87f6bf3d35c',1,'Point_< int >::Point_(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#afdc45cc80e589ff60b842782569f9304',1,'Point_< int >::Point_(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3d82eb725fc94c259b4467db3eb2f17c',1,'Point_< int >::Point_(const Size_< int > &sz)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a60730a6fd845368d2323f62a186d8fe7',1,'Point_< int >::Point_(const Vec< int, 2 > &v)']]], - ['point_5f_3c_20double_20_3e_387',['Point_< double >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'']]], - ['point_5f_3c_20float_20_3e_388',['Point_< float >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'']]], - ['point_5f_3c_20int_20_3e_389',['Point_< int >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'']]], - ['point_5fconst_5fiterator_5f_390',['point_const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html',1,'point_const_iterator_'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a2cf6f17c026eaa0ba79e8e3c4a3e5d7b',1,'point_const_iterator_::point_const_iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#ada6e22f4de631b12adb1b421764f5f3b',1,'point_const_iterator_::point_const_iterator_(const point_const_iterator_ &other)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#af9880948052666182bce3dec61ba6b5b',1,'point_const_iterator_::point_const_iterator_(const point_iterator_ &other)']]], - ['point_5finvalidation_5fguarantee_391',['point_invalidation_guarantee',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11199.html',1,'__gnu_pbds']]], - ['point_5fiterator_2ehpp_392',['point_iterator.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01463.html',1,'']]], - ['point_5fiterator_5f_393',['point_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html',1,'point_iterator_'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a3115c68fed82f555c6ae0d01e3d50caf',1,'point_iterator_::point_iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a74dce2de293ba5005f3a1bf007926bff',1,'point_iterator_::point_iterator_(const point_iterator_ &other)']]], - ['point_5fiterators_2ehpp_394',['point_iterators.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01223.html',1,'']]], - ['point_5fpolygon_5ftest_2emarkdown_395',['point_polygon_test.markdown',['https://docs.opencv.org/4.2.0/dc/ddd/point__polygon__test_8markdown.html',1,'']]], - ['point_5fsize_396',['POINT_SIZE',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acae2641145d37d70d4f6fa20344295d353',1,'cv::viz::POINT_SIZE'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acae2641145d37d70d4f6fa20344295d353',1,'POINT_SIZE(Global Namespace)']]], - ['pointat_397',['pointAt',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a925fd2bd7ce6927de196859f2f5bec41',1,'Eigen::ParametrizedLine']]], - ['pointdistribution_398',['PointDistribution',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#aa2a27f17a1a30fad4c54c248b77777e0',1,'cv::xfeatures2d::PCTSignatures']]], - ['pointee_5ftype_399',['pointee_type',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a7c679319f03206bc9c7f9a9561f01a2c',1,'cv::cudev::TypeTraits']]], - ['pointer_400',['pointer',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#ae28c6dc959d3f3480d71ada0165045ed',1,'cv::Allocator::pointer'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#abcc6516506c2198b43fad771c492b82d',1,'cv::MatConstIterator::pointer'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a60653ac7f1a885697abe8da0b5cb040b',1,'cv::MatConstIterator_::pointer'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#aa81cd9de718ad0ea55fa6bda0d66485c',1,'cv::MatIterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#a0907bb639cf9ac29dab204626ec12377',1,'__gnu_pbds::detail::binary_heap_const_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#abd81453d36a2f45a3609f24f0aa72fc7',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#a1db8d2d6a17d1ede94fa15d0d6056460',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#ad53a8fcb73619f92271d7972614ddde1',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a4931a231115cbef628c29b147a7d7336',1,'allocator_traits< _Tp_alloc_type >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#a138b64767ee1c612debd902ae852f055',1,'const_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< input_iterator_tag, _CharT, _Traits::off_type, _CharT *, _CharT >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< input_iterator_tag, _Tp, _Dist, const _Tp *, const _Tp & >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< iterator_traits< _Iterator >::iterator_category, iterator_traits< _Iterator >::value_type, iterator_traits< _Iterator >::difference_type, iterator_traits< _Iterator >::pointer, iterator_traits< _Iterator >::reference >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< output_iterator_tag, void, void, void, void >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< std::output_iterator_tag, void, void, void, void >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< std::random_access_iterator_tag, _CharT >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< std::random_access_iterator_tag, bool >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a5e8e32e609074706bc1124c6f143dcee',1,'iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a0e68152e66e7d8c3c236b2e120452564',1,'point_const_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a1db05c0220024671689e8f0110314c58',1,'point_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a4931a231115cbef628c29b147a7d7336',1,'std::allocator_traits::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a3203247b206cbdb36c897d1e8d82e8e8',1,'std::allocator_traits< allocator< _Tp > >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::back_insert_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::front_insert_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::insert_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::istream_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::istreambuf_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::ostream_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::ostreambuf_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06311.html#a7f43cc1c2c600c67cef1972c4618b357',1,'std::pointer_traits::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06323.html#a662e7c9fa1e9ba89bee4545c22aa3e5e',1,'std::pointer_traits< _Tp * >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::raw_storage_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab09384f7a9772d0e8c6175b572db898d',1,'std::set::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab09384f7a9772d0e8c6175b572db898d',1,'std::set::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ac0072ca4cb745124af7e8ae199b017c5',1,'std::unordered_map::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ac0072ca4cb745124af7e8ae199b017c5',1,'std::unordered_map::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aa9c05aec6bb3f18770d191869543334a',1,'std::unordered_multimap::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aa9c05aec6bb3f18770d191869543334a',1,'std::unordered_multimap::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0fd1cffa71f49d5bcea5c9fa1cb36312',1,'std::unordered_multiset::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0fd1cffa71f49d5bcea5c9fa1cb36312',1,'std::unordered_multiset::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#af18aca91916dd9537f3c33cd7746b0f4',1,'std::unordered_set::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#af18aca91916dd9537f3c33cd7746b0f4',1,'std::unordered_set::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ac0072ca4cb745124af7e8ae199b017c5',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ac0072ca4cb745124af7e8ae199b017c5',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::pointer'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a42e5c23402f4c2e1df487e1d102bc5fa.html#a42e5c23402f4c2e1df487e1d102bc5fa',1,'nlohmann::basic_json::pointer'],['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a97e8300b5eafd937dbb1315705f7102b',1,'cv::viz::MouseEvent::pointer']]], - ['pointer_20abstractions_401',['Pointer Abstractions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html',1,'']]], - ['pointer_2eh_402',['pointer.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01070.html',1,'']]], - ['pointer_5fto_403',['pointer_to',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06323.html#a8b9820e4bb36f07f95614134ce18a058',1,'std::pointer_traits< _Tp * >']]], - ['pointer_5fto_5fbinary_5ffunction_404',['pointer_to_binary_function',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07599.html',1,'std']]], - ['pointer_5fto_5funary_5ffunction_405',['pointer_to_unary_function',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07595.html',1,'std']]], - ['pointer_5ftraits_406',['pointer_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06311.html',1,'std']]], - ['pointer_5ftraits_3c_20_5ftp_20_2a_20_3e_407',['pointer_traits< _Tp * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06323.html',1,'std']]], - ['pointers_20to_20functions_408',['Adaptors for pointers to functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html',1,'']]], - ['pointers_20to_20members_409',['Adaptors for pointers to members',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01511.html',1,'']]], - ['pointpolygontest_410',['pointPolygonTest',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga1a539e8db2135af2566103705d7a5722',1,'cv::pointPolygonTest()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga1a539e8db2135af2566103705d7a5722',1,'pointPolygonTest()(Global Namespace)']]], - ['points_411',['points',['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#aff9d551d70bb7a2d7dfba4c1cce5c01a',1,'cv::gapi::wip::draw::Poly::points'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a69d648b086f26dbce0029facae9bfb2d',1,'cv::RotatedRect::points()']]], - ['points_412',['POINTS',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8b467f66c33c13df37f24aa3f1196f14',1,'cv::ogl::POINTS'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8b467f66c33c13df37f24aa3f1196f14',1,'POINTS(Global Namespace)']]], - ['pointsingrid_413',['pointsInGrid',['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#aa706613abb50ade9d32fff80b84dbfe0',1,'cv::TrackerMedianFlow::Params']]], - ['poisson_20distributions_414',['Poisson Distributions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html',1,'']]], - ['poisson_5fdistribution_415',['poisson_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html',1,'std']]], - ['polar_416',['polar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga6310fbff4c2a4056654d332fc0e68f04',1,'std::polar()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga6310fbff4c2a4056654d332fc0e68f04',1,'polar()(Global Namespace)']]], - ['polartocart_417',['polarToCart',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga581ff9d44201de2dd1b40a50db93d665',1,'cv::polarToCart()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga01516a286a329c303c2db746513dd9df',1,'cv::cuda::polarToCart()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gae523b4bd51ddcca2833c9aebbd7fe5a4',1,'cv::gapi::polarToCart()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga581ff9d44201de2dd1b40a50db93d665',1,'polarToCart(InputArray magnitude, InputArray angle, OutputArray x, OutputArray y, bool angleInDegrees=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gae523b4bd51ddcca2833c9aebbd7fe5a4',1,'polarToCart(const GMat &magnitude, const GMat &angle, bool angleInDegrees=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga01516a286a329c303c2db746513dd9df',1,'polarToCart(InputArray magnitude, InputArray angle, OutputArray x, OutputArray y, bool angleInDegrees=false, Stream &stream=Stream::Null())(Global Namespace)']]], - ['policy_20based_20data_20structures_418',['Policy-Based Data Structures',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01536.html',1,'']]], - ['policy_20classes_419',['Policy Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01531.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01535.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01529.html',1,'Base and Policy Classes']]], - ['poly_420',['Poly',['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html',1,'cv::gapi::wip::draw::Poly'],['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#a788badaaca4373e92cebaac609a20690',1,'cv::gapi::wip::draw::Poly::Poly()']]], - ['poly_421',['POLY',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56a5fa32d793cd5f5d0bf64f55bb94a3f2e',1,'cv::ml::SVM']]], - ['polygon_422',['POLYGON',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8c8c07e1f038e9fe452b06fb80d15c10',1,'cv::ogl::POLYGON'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8c8c07e1f038e9fe452b06fb80d15c10',1,'POLYGON(Global Namespace)']]], - ['polygon_20test_423',['Point Polygon Test',['https://docs.opencv.org/4.2.0/dc/d48/tutorial_point_polygon_test.html',1,'']]], - ['polygonalapproxaccuracyrate_424',['polygonalApproxAccuracyRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a4d77731cb95dcf9bb1cebf82573fc8eb',1,'cv::aruco::DetectorParameters']]], - ['polygons_425',['polygons',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#ac4482e5c832f2bd24bb697c340eaf853',1,'cv::viz::Mesh']]], - ['polylines_426',['polylines',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga1ea127ffbbb7e0bfc4fd6fd2eb64263c',1,'cv::polylines(InputOutputArray img, const Point *const *pts, const int *npts, int ncontours, bool isClosed, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaa3c25f9fb764b6bef791bf034f6e26f5',1,'cv::polylines(InputOutputArray img, InputArrayOfArrays pts, bool isClosed, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga1ea127ffbbb7e0bfc4fd6fd2eb64263c',1,'polylines(InputOutputArray img, const Point *const *pts, const int *npts, int ncontours, bool isClosed, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaa3c25f9fb764b6bef791bf034f6e26f5',1,'polylines(InputOutputArray img, InputArrayOfArrays pts, bool isClosed, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)']]], - ['polynomial_5fk1_427',['polynomial_k1',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#aa74e53f61a182e7c832d21c21739f14d',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['polynomial_5fk2_428',['polynomial_k2',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#aebaf73bf5121e7688b027b0bae218074',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['polynomial_5fk3_429',['polynomial_k3',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a3ba0193b4c12ae3dd2fa3edd34ee0e3b',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['polynomial_5fp1_430',['polynomial_p1',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#adb06d303c46a5932e43d683a12130219',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['polynomial_5fp2_431',['polynomial_p2',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#aeea8973777e2e1264a74e858f2f2f555',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['pool_432',['pool',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#ac12e3852d9f4482a1069703bc124868d',1,'cv::SparseMat::Hdr']]], - ['pool_5fallocator_2eh_433',['pool_allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01073.html',1,'']]], - ['pooledsize_434',['pooledSize',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a8343d4efd5c253de967ac68000ab2b7b',1,'cv::dnn::PoolingLayer']]], - ['poolinglayer_435',['PoolingLayer',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html',1,'cv::dnn']]], - ['poolkernel_436',['poolKernel',['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html#a072352f6d14ae4d334726fbbc9b20cd9',1,'cv::dnn::MaxUnpoolLayer']]], - ['poolpad_437',['poolPad',['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html#ace235835cca6ba7b807e8542a8ea9bf1',1,'cv::dnn::MaxUnpoolLayer']]], - ['poolstride_438',['poolStride',['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html#a8e1d6155038314c33128a01d6e2472e9',1,'cv::dnn::MaxUnpoolLayer']]], - ['pop_439',['pop',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a16b93d714717c5af52a14ebd6fec11b7',1,'stack< _StateSeqT >::pop()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#a935091a0132d887f9d3f87686c5598ac',1,'std::priority_queue::pop()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#ab918d7f862088e93a884cffae6dd9058',1,'std::queue::pop()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a16b93d714717c5af52a14ebd6fec11b7',1,'std::stack::pop()']]], - ['pop_5fback_440',['pop_back',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a88bbb01901fdfe3f1d0592c592e8757c',1,'cv::Mat::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#afa3b9e5ebf3b075576d5f9d8a4b9aa18',1,'__gnu_cxx::__versa_string::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#aff5854a49d63fcd08aae08eb282361e7',1,'__gnu_parallel::_RestrictedBoundedConcurrentQueue::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#aff5854a49d63fcd08aae08eb282361e7',1,'_RestrictedBoundedConcurrentQueue< pair< _RAIter, _RAIter > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< _CharT >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< _CharT, _Traits, _Allocator >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< char >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< char, char_traits< char >, _Byte_alloc >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< char_type, _Traits, _Alloc >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< value_type >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a2299790b7c0080b2652ba374a2ea68fc',1,'deque< _StateSeqT >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a437f35446fc4e342d4df581335191a69',1,'list< __inp, __rebind_inp >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'match_results< _Bi_iter >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'std::basic_string::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a2299790b7c0080b2652ba374a2ea68fc',1,'std::deque::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a437f35446fc4e342d4df581335191a69',1,'std::list::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'std::match_results::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'std::vector::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< __diff_type >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _CharClassT >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _CharT >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _Cmpt >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _Node *, _Nodeptr_Alloc >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _RealType >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _State< _TraitsT::char_type > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _StringT >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< block_type, allocator_type >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< Catalog_info * >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< double >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< int >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< result_type >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< size_t >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< std::pair< _BiIter, int > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< std::pair< _StateIdT, std::vector > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< std::pair< _StrTransT, _StrTransT > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< sub_match< _Bi_iter >, _Alloc >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< sub_match< _BiIter >, _Alloc >::pop_back()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a4b1ee4d511ca195bed896a3da47e264c.html#a4b1ee4d511ca195bed896a3da47e264c',1,'nlohmann::json_pointer::pop_back()']]], - ['pop_5ffront_441',['pop_front',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#a4b760899cefaccb86586c447b12c4cc3',1,'__gnu_parallel::_RestrictedBoundedConcurrentQueue::pop_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#a4b760899cefaccb86586c447b12c4cc3',1,'_RestrictedBoundedConcurrentQueue< pair< _RAIter, _RAIter > >::pop_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a3f5c33f2728f70a589e11a2e8b013e78',1,'deque< _StateSeqT >::pop_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad744f7f3b84fc57c973ed2d3bb25a33e',1,'list< __inp, __rebind_inp >::pop_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a3f5c33f2728f70a589e11a2e8b013e78',1,'std::deque::pop_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ace75c01c591425341e21b6404e7f9e90',1,'std::forward_list::pop_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad744f7f3b84fc57c973ed2d3bb25a33e',1,'std::list::pop_front()']]], - ['pop_5fheap_442',['pop_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga92aecc13151c6b58598e3dd9e54064b7',1,'std::pop_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga27b771598145e151f01281b5cb0fdbbb',1,'std::pop_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga92aecc13151c6b58598e3dd9e54064b7',1,'pop_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga27b771598145e151f01281b5cb0fdbbb',1,'pop_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['popcounttable_443',['popCountTable',['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1b8c26bf1cd9b597cdb9f20501a72f76',1,'cv::popCountTable'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1b8c26bf1cd9b597cdb9f20501a72f76',1,'popCountTable(Global Namespace)']]], - ['portcfg_444',['PortCfg',['https://docs.opencv.org/4.2.0/dd/d98/structcv_1_1gapi_1_1ie_1_1PortCfg.html',1,'cv::gapi::ie']]], - ['porting_20anisotropic_20image_20segmentation_20on_20g_20api_445',['Porting anisotropic image segmentation on G-API',['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'']]], - ['porting_5fanisotropic_5fsegmentation_2emarkdown_446',['porting_anisotropic_segmentation.markdown',['https://docs.opencv.org/4.2.0/da/d38/porting__anisotropic__segmentation_8markdown.html',1,'']]], - ['pos_447',['pos',['https://docs.opencv.org/4.2.0/d4/d6a/structcv_1_1optflow_1_1GPCPatchSample.html#aa1974f4d48d7c895fe29447d29696396',1,'cv::optflow::GPCPatchSample::pos'],['https://docs.opencv.org/4.2.0/d8/d7d/structcv_1_1datasets_1_1IR__robotObj.html#a3fce07cd1c3d3087d39099669651cab2',1,'cv::datasets::IR_robotObj::pos'],['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a1b88e497f772a9b1c18b66523b75efc9',1,'NppStInterpolationState::pos'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#afeddb548b519ef727e3d07b2361cd8e1',1,'cv::LineIterator::pos()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a85189ac66049666ba8cb89540fef5a63',1,'cv::MatConstIterator::pos() const'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ab64bff4ef3fbbb286699ce294871624a',1,'cv::MatConstIterator::pos(int *_idx) const'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#add5eb752db0027a38d82fa6e7b71af3d',1,'cv::MatConstIterator_::pos()']]], - ['pos_448',['POS',['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba5d7a482a7505fa7d961f2e61643b7bc1',1,'cv::datasets::POS'],['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba5d7a482a7505fa7d961f2e61643b7bc1',1,'POS(Global Namespace)']]], - ['pos_5fformat_449',['pos_format',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ae2069e06feb0ddbc8d8ca90a4ef647ea',1,'std::moneypunct::pos_format() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ae2069e06feb0ddbc8d8ca90a4ef647ea',1,'std::moneypunct::pos_format() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ae2069e06feb0ddbc8d8ca90a4ef647ea',1,'std::moneypunct_byname::pos_format() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ae2069e06feb0ddbc8d8ca90a4ef647ea',1,'std::moneypunct_byname::pos_format() const']]], - ['pos_5ftype_450',['pos_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a1a7a5dbd05bfd3ebcc7a4febd35e58d9',1,'basic_ios< char, _Traits >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a1a7a5dbd05bfd3ebcc7a4febd35e58d9',1,'basic_ios< char, _Traits >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'basic_streambuf< _Elem, _Tr >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'basic_streambuf< _Elem, _Tr >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'basic_streambuf< char, _Traits >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'basic_streambuf< char, _Traits >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'basic_streambuf< char, char_traits< char > >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'basic_streambuf< char, char_traits< char > >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a1a7a5dbd05bfd3ebcc7a4febd35e58d9',1,'std::basic_ios::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a1a7a5dbd05bfd3ebcc7a4febd35e58d9',1,'std::basic_ios::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'std::basic_streambuf::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'std::basic_streambuf::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'std::wbuffer_convert::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'std::wbuffer_convert::pos_type']]], - ['pose_451',['pose',['https://docs.opencv.org/4.2.0/dd/dbd/structcv_1_1datasets_1_1pose.html',1,'cv::datasets::pose'],['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#a96deeb2b971ea1d9d47188f39d64118a',1,'cv::datasets::GR_skigObj::pose'],['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#ad90bbb2454858374c66f12016a85380b',1,'cv::datasets::PascalObj::pose'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a20e16c79d3e967f864641d0e618284a5',1,'cv::ppf_match_3d::Pose3D::pose'],['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html#af373b82a65b00e9d632317b47e6cf0f2',1,'cv::multicalib::MultiCameraCalibration::vertex::pose']]], - ['pose_20estimation_452',['Pose Estimation',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'CNN for 3D Object Classification and Pose Estimation'],['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html',1,'Human Pose Estimation'],['https://docs.opencv.org/4.2.0/d7/d53/tutorial_py_pose.html',1,'Pose Estimation']]], - ['pose_20estimation_20api_453',['3D object recognition and pose estimation API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'']]], - ['pose_20estimation_20of_20a_20textured_20object_454',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], - ['pose_20of_20a_20widget_455',['Pose of a widget',['https://docs.opencv.org/4.2.0/d8/df0/tutorial_widget_pose.html',1,'']]], - ['pose3d_456',['Pose3D',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html',1,'cv::ppf_match_3d::Pose3D'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#afb35d62e7106cecffb6ab166f3baf606',1,'cv::ppf_match_3d::Pose3D::Pose3D()'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a2af6a081884463b2deb382ae9aef5934',1,'cv::ppf_match_3d::Pose3D::Pose3D(double Alpha, size_t ModelIndex=0, size_t NumVotes=0)']]], - ['pose3dptr_457',['Pose3DPtr',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaace349a5dbee5aa24dd68d8f57518902',1,'cv::ppf_match_3d::Pose3DPtr'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaace349a5dbee5aa24dd68d8f57518902',1,'Pose3DPtr(Global Namespace)']]], - ['pose_5f3d_2ehpp_458',['pose_3d.hpp',['https://docs.opencv.org/4.2.0/d8/d9d/pose__3d_8hpp.html',1,'']]], - ['posecluster3d_459',['PoseCluster3D',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html',1,'cv::ppf_match_3d::PoseCluster3D'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a404b98cb537684789cd9b5a06d554087',1,'cv::ppf_match_3d::PoseCluster3D::PoseCluster3D()'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a0a5fd1b66f5c16a51d9afedf32fbac83',1,'cv::ppf_match_3d::PoseCluster3D::PoseCluster3D(Pose3DPtr newPose)'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#ae1bb2cca75814df5badae55fffdc601d',1,'cv::ppf_match_3d::PoseCluster3D::PoseCluster3D(Pose3DPtr newPose, int newId)']]], - ['posecluster3dptr_460',['PoseCluster3DPtr',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga89a4263e9791e1a3c81f4403cd0ad5a3',1,'cv::ppf_match_3d::PoseCluster3DPtr'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga89a4263e9791e1a3c81f4403cd0ad5a3',1,'PoseCluster3DPtr(Global Namespace)']]], - ['poselist_461',['poseList',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a84383c0098dac446b5ef9338a2c294ba',1,'cv::ppf_match_3d::PoseCluster3D']]], - ['posesarray_462',['posesArray',['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html#abbc38afefaaddd2a451a62e8419581a4',1,'cv::datasets::SLAM_kittiObj']]], - ['posetype_463',['poseType',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ga82775e152f8a74c5fe06f5a7343e0233',1,'cv::datasets::poseType'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ga82775e152f8a74c5fe06f5a7343e0233',1,'poseType(Global Namespace)']]], - ['position_464',['position',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a258ebf7a862afc9be1ef8b188393b298',1,'match_results< _Bi_iter >::position(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a258ebf7a862afc9be1ef8b188393b298',1,'match_results< _Bi_iter >::position(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a258ebf7a862afc9be1ef8b188393b298',1,'std::match_results::position()']]], - ['position_5fthreshold_465',['position_threshold',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a7b87b6bec0033ccb112f1ea211be2e1f',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['positionsvector_466',['PositionsVector',['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#a78fa153c66224921eed2567e91aec1ba',1,'cv::DetectionBasedTracker::TrackedObject']]], - ['positive_5fpwm_5fscales_467',['positive_pwm_scales',['../namespacerobot.html#abf2d3136c13712a212ebf41ed4a6ff58',1,'robot']]], - ['positive_5fsign_468',['positive_sign',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a3c7d2522e2dc2a5fa2634a1a18b873c4',1,'std::moneypunct::positive_sign()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a3c7d2522e2dc2a5fa2634a1a18b873c4',1,'std::moneypunct_byname::positive_sign()']]], - ['post_20filtering_469',['Disparity map post-filtering',['https://docs.opencv.org/4.2.0/d3/d14/tutorial_ximgproc_disparity_filtering.html',1,'']]], - ['postprocess_470',['postprocess',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a90788819ae75ed8cc94331159859d133',1,'cv::detail']]], - ['postprocess_5focl_471',['postprocess_ocl',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a8c6a7120c4c06f085a6bc3503243c4d9',1,'cv::detail']]], - ['postprocessframe_472',['postProcessFrame',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#a9f5989a3c55cc05e11b15a720cfb96cd',1,'cv::videostab::OnePassStabilizer::postProcessFrame()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aeaeea250e70f8618e72a2f4fe8224398',1,'cv::videostab::StabilizerBase::postProcessFrame()'],['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a2dd1f28556984f5a955224a377ba3cb5',1,'cv::videostab::TwoPassStabilizer::postProcessFrame()']]], - ['postypes_2eh_473',['postypes.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00443.html',1,'']]], - ['potparams_5ft_474',['potparams_t',['../structrobot_1_1potparams__t.html',1,'robot']]], - ['pow_475',['pow',['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#acb769e1ab1d809abb77c7ab98021ad81',1,'Eigen::ArrayBase::pow(const Eigen::ArrayBase< Derived > &x, const Eigen::ArrayBase< ExponentDerived > &exponents)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a5df3d99d47747b72d61f235c9fb925e3',1,'Eigen::ArrayBase::pow(const Eigen::ArrayBase< Derived > &x, const ScalarExponent &exponent)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#acb7a6224d50620991d1fb9888b8be6e6',1,'Eigen::ArrayBase::pow(const Scalar &x, const Eigen::ArrayBase< Derived > &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#acb769e1ab1d809abb77c7ab98021ad81',1,'ArrayBase< ArrayWrapper< ExpressionType > >::pow(const Eigen::ArrayBase< ArrayWrapper< ExpressionType > > &x, const Eigen::ArrayBase< ExponentDerived > &exponents)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a5df3d99d47747b72d61f235c9fb925e3',1,'ArrayBase< ArrayWrapper< ExpressionType > >::pow(const Eigen::ArrayBase< ArrayWrapper< ExpressionType > > &x, const ScalarExponent &exponent)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#acb7a6224d50620991d1fb9888b8be6e6',1,'ArrayBase< ArrayWrapper< ExpressionType > >::pow(const Scalar &x, const Eigen::ArrayBase< ArrayWrapper< ExpressionType > > &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ae6c25e6a94a60e147741e76203a73b',1,'Eigen::MatrixBase::pow(const RealScalar &p) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a91dcacf224bd8b18346914bdf7eefc31',1,'Eigen::MatrixBase::pow(const std::complex< RealScalar > &p) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ae6c25e6a94a60e147741e76203a73b',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::pow(const RealScalar &p) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a91dcacf224bd8b18346914bdf7eefc31',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::pow(const std::complex< RealScalar > &p) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ae6c25e6a94a60e147741e76203a73b',1,'MatrixBase< Solve< Decomposition, RhsType > >::pow(const RealScalar &p) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a91dcacf224bd8b18346914bdf7eefc31',1,'MatrixBase< Solve< Decomposition, RhsType > >::pow(const std::complex< RealScalar > &p) const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga8bc36646a43b82baa15f151a973fb0c5',1,'cv::pow(const softfloat &a, const softfloat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaa02f6b3f5671b691159973a056e57980',1,'cv::pow(const softdouble &a, const softdouble &b)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf0d056b5bd1dc92500d6f6cf6bac41ef',1,'cv::pow(InputArray src, double power, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga82d04ef4bcc4dfa9bfbe76488007c6c4',1,'cv::cuda::pow()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf0d056b5bd1dc92500d6f6cf6bac41ef',1,'pow(InputArray src, double power, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga8bc36646a43b82baa15f151a973fb0c5',1,'pow(const softfloat &a, const softfloat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaa02f6b3f5671b691159973a056e57980',1,'pow(const softdouble &a, const softdouble &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga82d04ef4bcc4dfa9bfbe76488007c6c4',1,'pow(InputArray src, double power, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaacf8017e100d619acab131da8a4017e1',1,'std::pow(const complex< _Tp > &, int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga6e1161f2920c46a042888c60e9d8447c',1,'std::pow(const complex< _Tp > &, const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gad07a5f0000890bb20d170700575d210c',1,'std::pow(const complex< _Tp > &, const complex< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gadb1a322e1cc55220dc7ff754815ffbc7',1,'std::pow(const _Tp &, const complex< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaab6ff7d7d6909209885edbc25b74a930',1,'std::tr1::pow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaacf8017e100d619acab131da8a4017e1',1,'pow(const complex< _Tp > &, int)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga6e1161f2920c46a042888c60e9d8447c',1,'pow(const complex< _Tp > &, const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gad07a5f0000890bb20d170700575d210c',1,'pow(const complex< _Tp > &, const complex< _Tp > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gadb1a322e1cc55220dc7ff754815ffbc7',1,'pow(const _Tp &, const complex< _Tp > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaab6ff7d7d6909209885edbc25b74a930',1,'pow(const std::complex< _Tp > &__x, const _Up &__y)(Global Namespace)']]], - ['pow_5f_476',['pow_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa69bd5c46cef6040c304293356b69151',1,'cv::cudev::pow_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa69bd5c46cef6040c304293356b69151',1,'pow_()(Global Namespace)']]], - ['pow_5ffunc_477',['pow_func',['https://docs.opencv.org/4.2.0/da/dda/structcv_1_1cudev_1_1pow__func.html',1,'cv::cudev']]], - ['pow_5ffunc_3c_20double_20_3e_478',['pow_func< double >',['https://docs.opencv.org/4.2.0/d2/deb/structcv_1_1cudev_1_1pow__func_3_01double_01_4.html',1,'cv::cudev']]], - ['power_479',['power',['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1dnn_1_1PowerLayer.html#a4601f5017ef110040e09ece8307a2888',1,'cv::dnn::PowerLayer::power'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga52a0d4d0aad4e35cbcc82c8be1dfcebe',1,'__gnu_cxx::power(_Tp __x, _Integer __n, _MonoidOperation __monoid_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga2a1a321e469c0cafa50d1085b27ebbc3',1,'__gnu_cxx::power(_Tp __x, _Integer __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga52a0d4d0aad4e35cbcc82c8be1dfcebe',1,'power(_Tp __x, _Integer __n, _MonoidOperation __monoid_op)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga2a1a321e469c0cafa50d1085b27ebbc3',1,'power(_Tp __x, _Integer __n)(Global Namespace)']]], - ['powerlayer_480',['PowerLayer',['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1dnn_1_1PowerLayer.html',1,'cv::dnn']]], - ['powerrepeattask_481',['PowerRepeatTask',['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html',1,'net::mc::tasks']]], - ['ppbuffers_482',['ppBuffers',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#ac3a1af68ad97248705ef457596e00f64',1,'NppStInterpolationState']]], - ['ppf_483',['ppf',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a104f79f2f9f2d9b4e6b7f9c1c107f395',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['ppf3ddetector_484',['PPF3DDetector',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html',1,'cv::ppf_match_3d::PPF3DDetector'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#abe2433c0b4eb9be6506172aeccdd534e',1,'cv::ppf_match_3d::PPF3DDetector::PPF3DDetector()'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a10173afac3cb9d9fe99e11e0d4d56f81',1,'cv::ppf_match_3d::PPF3DDetector::PPF3DDetector(const double relativeSamplingStep, const double relativeDistanceStep=0.05, const double numAngles=30)']]], - ['ppf_5fhelpers_2ehpp_485',['ppf_helpers.hpp',['https://docs.opencv.org/4.2.0/d9/dd2/ppf__helpers_8hpp.html',1,'']]], - ['ppf_5fmatch_5f3d_2ehpp_486',['ppf_match_3d.hpp',['https://docs.opencv.org/4.2.0/d5/d52/ppf__match__3d_8hpp.html',1,'']]], - ['ppfind_487',['ppfInd',['https://docs.opencv.org/4.2.0/da/dff/structTHash.html#ab8659b1eb899d80a03739b7462419bf0',1,'THash']]], - ['ppjr_488',['ppjr',['../structrobot_1_1encparams__t.html#a569ee2230808fa6c878923f174515a23',1,'robot::encparams_t']]], - ['pptr_489',['pptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'__gnu_cxx::enc_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'__gnu_cxx::enc_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'__gnu_cxx::stdio_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'__gnu_cxx::stdio_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'__gnu_cxx::stdio_sync_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'__gnu_cxx::stdio_sync_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_filebuf< char_type, traits_type >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_filebuf< char_type, traits_type >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_streambuf< _Elem, _Tr >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_streambuf< _Elem, _Tr >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_streambuf< char, _Traits >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_streambuf< char, _Traits >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_streambuf< char, char_traits< char > >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_streambuf< char, char_traits< char > >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::basic_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::basic_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::basic_streambuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::basic_streambuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::basic_stringbuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::basic_stringbuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::wbuffer_convert::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::wbuffer_convert::pptr() const']]], - ['ppx_490',['ppx',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#ad2ee5acb3760aa3e94c2cf711ad127e9',1,'cv::detail::CameraParams']]], - ['ppy_491',['ppy',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#a3a896fe0f6a7851c449eaf063af94d49',1,'cv::detail::CameraParams']]], - ['practices_492',['Best Practices',['../md_StyleGuide.html#autotoc_md3',1,'']]], - ['precision_493',['precision',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'basic_ios< char, _Traits >::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'basic_ios< char, _Traits >::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'basic_iostream< char >::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'basic_iostream< char >::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'basic_istream< char >::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'basic_istream< char >::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'basic_istream< char, _Traits >::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'basic_istream< char, _Traits >::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'basic_ostream< char >::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'basic_ostream< char >::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'basic_ostream< char, _Traits >::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'basic_ostream< char, _Traits >::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_fstream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_fstream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_ifstream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_ifstream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_ios::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_ios::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_iostream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_iostream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_istream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_istream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_istringstream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_istringstream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_ofstream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_ofstream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_ostream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_ostream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_ostringstream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_ostringstream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_stringstream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_stringstream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::ios_base::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::ios_base::precision(streamsize __prec)']]], - ['preconditioner_494',['preconditioner',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a5e88f2a323a2900205cf807af94f8051',1,'Eigen::IterativeSolverBase::preconditioner()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a709a056e17c49b5272e4971bc376cbe4',1,'Eigen::IterativeSolverBase::preconditioner() const']]], - ['preconditionerfrompoints_495',['preconditionerFromPoints',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga85b7dbb7aebde1e970ec1c034edfd19c',1,'cv::sfm::preconditionerFromPoints()'],['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga85b7dbb7aebde1e970ec1c034edfd19c',1,'preconditionerFromPoints()(Global Namespace)']]], - ['precornerdetect_496',['preCornerDetect',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gaa819f39b5c994871774081803ae22586',1,'cv::preCornerDetect()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gaa819f39b5c994871774081803ae22586',1,'preCornerDetect()(Global Namespace)']]], - ['pred_497',['pred',['https://docs.opencv.org/4.2.0/d1/d81/structcv_1_1cudev_1_1BinaryNegate.html#addec158325891027e595ca01b96ea064',1,'cv::cudev::BinaryNegate::pred'],['https://docs.opencv.org/4.2.0/d2/d83/structcv_1_1cudev_1_1UnaryNegate.html#a870d0d91c7c71abfc7759b6046ab8967',1,'cv::cudev::UnaryNegate::pred']]], - ['predefined_5fdictionary_5fname_498',['PREDEFINED_DICTIONARY_NAME',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gac84398a9ed9dd01306592dd616c2c975',1,'cv::aruco::PREDEFINED_DICTIONARY_NAME'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gac84398a9ed9dd01306592dd616c2c975',1,'PREDEFINED_DICTIONARY_NAME(Global Namespace)']]], - ['predefined_5fops_2eh_499',['predefined_ops.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00446.html',1,'']]], - ['predict_500',['predict',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a246319d4d89c7dd58bac54a27d9378f8',1,'cv::tbm::TrackerParams::predict'],['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ae3f12147ba846a53601b60c784ee263d',1,'cv::ml::EM::predict()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#aa2d2f02faffab1bf01317ae6502fb631',1,'cv::face::FaceRecognizer::predict(InputArray src) const'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#ab0d593e53ebd9a0f350c989fcac7f251',1,'cv::face::FaceRecognizer::predict(InputArray src, int &label, double &confidence) const'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#afc5af8e603b525e9cdc6b3ddcd7cf83f',1,'cv::face::FaceRecognizer::predict(InputArray src, Ptr< PredictCollector > collector) const=0'],['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#aa710d2255566bec8d6ce608d103d4fa7',1,'cv::KalmanFilter::predict()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a2fca689e7cc1046c6ac459611be0f0f2',1,'cv::ml::LogisticRegression::predict()'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a6d39f78e25182db6d6f66b2312ca37e6',1,'cv::dnn::Model::predict()'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#a1a7e49e1febd10392452727498771bc1',1,'cv::ml::StatModel::predict()'],['https://docs.opencv.org/4.2.0/de/d72/classcv_1_1tracking_1_1UnscentedKalmanFilter.html#aa01ae27428459e61b6a260f44af97c95',1,'cv::tracking::UnscentedKalmanFilter::predict()'],['../classfilters_1_1ExtendedKalmanFilter.html#a9c84b7fe3c850719718405399e329899',1,'filters::ExtendedKalmanFilter::predict()'],['../classfilters_1_1KalmanFilter.html#aff9450b925ea5c8128079dc4c21ff0be',1,'filters::KalmanFilter::predict()'],['../classfilters_1_1KalmanFilterBase.html#ad37fc23432aa56b8a87f2aa1aa42ca0c',1,'filters::KalmanFilterBase::predict()']]], - ['predict2_501',['predict2',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a2ea7da92a75bc7a7d665c241f547b9b9',1,'cv::ml::EM']]], - ['predict_5fauto_502',['PREDICT_AUTO',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a7afa5cd2289fb88989c0ab1b8b5d8ac2af0192db97208b67118f642530da47332',1,'cv::ml::DTrees']]], - ['predict_5fcollector_2ehpp_503',['predict_collector.hpp',['https://docs.opencv.org/4.2.0/d9/d98/predict__collector_8hpp.html',1,'']]], - ['predict_5fmask_504',['PREDICT_MASK',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a7afa5cd2289fb88989c0ab1b8b5d8ac2a59a0cd54206e4092bc2bff1ce50c8afa',1,'cv::ml::DTrees']]], - ['predict_5fmax_5fvote_505',['PREDICT_MAX_VOTE',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a7afa5cd2289fb88989c0ab1b8b5d8ac2ad753bae4672b471203e418d820c00e85',1,'cv::ml::DTrees']]], - ['predict_5fsum_506',['PREDICT_SUM',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a7afa5cd2289fb88989c0ab1b8b5d8ac2a1d3f6687120ea6b337f6a91234529a13',1,'cv::ml::DTrees']]], - ['predictcollector_507',['PredictCollector',['https://docs.opencv.org/4.2.0/da/d6a/classcv_1_1face_1_1PredictCollector.html',1,'cv::face']]], - ['predicted_5frect_508',['predicted_rect',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#ae30489e04af4f73ce5241a5989e539e7',1,'cv::tbm::Track']]], - ['prediction_2emarkdown_509',['prediction.markdown',['https://docs.opencv.org/4.2.0/dd/df3/prediction_8markdown.html',1,'']]], - ['predictoptimalvectorwidth_510',['predictOptimalVectorWidth',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga1b16507915166d63529ad8126e465c1a',1,'cv::ocl::predictOptimalVectorWidth()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga1b16507915166d63529ad8126e465c1a',1,'predictOptimalVectorWidth()(Global Namespace)']]], - ['predictoptimalvectorwidthmax_511',['predictOptimalVectorWidthMax',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga8b96cd547eac1e787cf50e22820bc4b9',1,'cv::ocl::predictOptimalVectorWidthMax()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga8b96cd547eac1e787cf50e22820bc4b9',1,'predictOptimalVectorWidthMax()(Global Namespace)']]], - ['predictprob_512',['predictProb',['https://docs.opencv.org/4.2.0/d4/d8e/classcv_1_1ml_1_1NormalBayesClassifier.html#a146e961a610d26f3c3c3b85da5406e08',1,'cv::ml::NormalBayesClassifier']]], - ['predictresult_513',['PredictResult',['https://docs.opencv.org/4.2.0/d2/d5a/structcv_1_1face_1_1StandardCollector_1_1PredictResult.html',1,'cv::face::StandardCollector::PredictResult'],['https://docs.opencv.org/4.2.0/d2/d5a/structcv_1_1face_1_1StandardCollector_1_1PredictResult.html#a5610c5f6064c63d0d984c109a962b9e4',1,'cv::face::StandardCollector::PredictResult::PredictResult()']]], - ['preferabletarget_514',['preferableTarget',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a35e0e4f0e8441d1b0e62c596df6b1942',1,'cv::dnn::Layer']]], - ['preferedworkgroupsizemultiple_515',['preferedWorkGroupSizeMultiple',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a4c7c188799b17f593647f3476de0ec4f',1,'cv::ocl::Kernel']]], - ['preferredvectorwidthchar_516',['preferredVectorWidthChar',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a8de7518d696d8bca07cf792422b47be4',1,'cv::ocl::Device']]], - ['preferredvectorwidthdouble_517',['preferredVectorWidthDouble',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2c0ca2b983966a2aeff861b7d6fd4480',1,'cv::ocl::Device']]], - ['preferredvectorwidthfloat_518',['preferredVectorWidthFloat',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a588b64852f17bcb7cd120507d4f6e0f4',1,'cv::ocl::Device']]], - ['preferredvectorwidthhalf_519',['preferredVectorWidthHalf',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0c8276f354defd3286fa7c714cd32950',1,'cv::ocl::Device']]], - ['preferredvectorwidthint_520',['preferredVectorWidthInt',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a27db2c75d80aab51898646c8cd196f3b',1,'cv::ocl::Device']]], - ['preferredvectorwidthlong_521',['preferredVectorWidthLong',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ad572c1f0616eff7b7f4ef619fe4db95a',1,'cv::ocl::Device']]], - ['preferredvectorwidthshort_522',['preferredVectorWidthShort',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a48fad69242e5a910149f2a8145a4046c',1,'cv::ocl::Device']]], - ['preferredvelpreservation_523',['PreferredVelPreservation',['../classkinematics_1_1DiffDriveKinematics.html#a86eec2022910a71e36af970c0995c4ba',1,'kinematics::DiffDriveKinematics']]], - ['prefilter_5fnormalized_5fresponse_524',['PREFILTER_NORMALIZED_RESPONSE',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a132c8592df90dfeb4564f173906098c3a4f085923f5d5fe24ca626d92786badbc',1,'cv::stereo::StereoBinaryBM::PREFILTER_NORMALIZED_RESPONSE'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#aa186af0c0db79e9a53e232824c40e363a9b5f32162b35799e3c29e1bfd73e93df',1,'cv::StereoBM::PREFILTER_NORMALIZED_RESPONSE']]], - ['prefilter_5fxsobel_525',['PREFILTER_XSOBEL',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a132c8592df90dfeb4564f173906098c3a2363d746ab876d6be236d61c6377bdca',1,'cv::stereo::StereoBinaryBM::PREFILTER_XSOBEL'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#aa186af0c0db79e9a53e232824c40e363abf381e03e290b2b94541738193a6abd6',1,'cv::StereoBM::PREFILTER_XSOBEL']]], - ['prefix_526',['prefix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4f1ab979440a0c53c13422a5d628144e',1,'match_results< _Bi_iter >::prefix() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4f1ab979440a0c53c13422a5d628144e',1,'match_results< _Bi_iter >::prefix() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4f1ab979440a0c53c13422a5d628144e',1,'std::match_results::prefix()']]], - ['prefix_5frange_527',['prefix_range',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#ac07e23033a7082e95a059e56227a5a79',1,'__gnu_pbds::trie_prefix_search_node_update::prefix_range(key_const_reference) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#a0a5588142f380274ac33c5a243b394d1',1,'__gnu_pbds::trie_prefix_search_node_update::prefix_range(key_const_reference)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#a5c3ff0a8d56d0d771d3391ae1d0de06e',1,'__gnu_pbds::trie_prefix_search_node_update::prefix_range(a_const_iterator, a_const_iterator) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#af29b3894ff0f8fad9217cdcde5e5af1f',1,'__gnu_pbds::trie_prefix_search_node_update::prefix_range(a_const_iterator, a_const_iterator)']]], - ['prefix_5fsearch_5fnode_5fupdate_5fimp_2ehpp_528',['prefix_search_node_update_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01445.html',1,'']]], - ['prep_529',['prep',['https://docs.opencv.org/4.2.0/dd/d1c/classcv_1_1gapi_1_1wip_1_1GCaptureSource.html#a609ad8dfcb829ed321a48bc9392444cd',1,'cv::gapi::wip::GCaptureSource']]], - ['prepare_530',['prepare',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#aeb4e38fed207e6da858cb7f64ae95dbc',1,'cv::detail::Blender::prepare(const std::vector< Point > &corners, const std::vector< Size > &sizes)'],['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#a6d81cd6a0a2284de3ec7898409c7c0a8',1,'cv::detail::Blender::prepare(Rect dst_roi)'],['https://docs.opencv.org/4.2.0/d4/d69/classcv_1_1detail_1_1FeatherBlender.html#a086623ff68da90071aca0fa79ebeaac0',1,'cv::detail::FeatherBlender::prepare()'],['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html#ac108b634893bbbae59ac3a3562fed070',1,'cv::detail::MultiBandBlender::prepare()']]], - ['prepareframecache_531',['prepareFrameCache',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a578c1849dbc9df24d80ffc28fda6f9c8',1,'cv::rgbd::FastICPOdometry::prepareFrameCache()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a651fe7eab423d79d258c8f26d12601a0',1,'cv::rgbd::ICPOdometry::prepareFrameCache()'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a894cc56de5ecc916d19a7984c6f307a8',1,'cv::rgbd::Odometry::prepareFrameCache()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#af1568ca5cfe8f3f1ac2fc43f8d566f7a',1,'cv::rgbd::RgbdICPOdometry::prepareFrameCache()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a69a299421caa7871356c8931ef64b3ee',1,'cv::rgbd::RgbdOdometry::prepareFrameCache()']]], - ['preprocessed_5finput_532',['PREPROCESSED_INPUT',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af1ea864e1c19796e6264ebb3950c0b9aa0cdfa2b3b9c5947d9a80bcca7eac485f',1,'cv::ml::StatModel']]], - ['preprocessedframe_5f_533',['preProcessedFrame_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#acffea61e04a38c512e09a643ae2c8d13',1,'cv::videostab::StabilizerBase']]], - ['preprocessor_20directives_534',['Preprocessor directives',['https://eigen.tuxfamily.org/dox/TopicPreprocessorDirectives.html',1,'']]], - ['prerotate_535',['prerotate',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ac5d65c2387e8d8b8f1526fc2c8443661',1,'Eigen::Transform']]], - ['prescale_536',['prescale',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a0d87009c9449d1920c037eb58468e757',1,'Eigen::Transform::prescale(const MatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a96c5e49e1d779299f4975dfef93e14b3',1,'Eigen::Transform::prescale(const Scalar &s)']]], - ['preserving_20decolorization_537',['Contrast Preserving Decolorization',['https://docs.opencv.org/4.2.0/d4/d32/group__photo__decolor.html',1,'']]], - ['preset_5ffast_538',['PRESET_FAST',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a6c7cf2e6b3c9cf450a1f73185bed1300acac18d130d259ee7dcdd6a874508b047',1,'cv::DISOpticalFlow']]], - ['preset_5fmedium_539',['PRESET_MEDIUM',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a6c7cf2e6b3c9cf450a1f73185bed1300a2ed2f21190ccc2e47a480615407d61aa',1,'cv::DISOpticalFlow']]], - ['preset_5fultrafast_540',['PRESET_ULTRAFAST',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a6c7cf2e6b3c9cf450a1f73185bed1300a9f90dcf9da43619e3c401f0c0956f998',1,'cv::DISOpticalFlow']]], - ['presets_541',['Presets',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#aea50d9f35bb932de907f5b83defc4151',1,'cv::cudacodec::EncoderParams']]], - ['preshear_542',['preshear',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a17c40209cfd2d094cf654504aca95bf1',1,'Eigen::Transform']]], - ['pretranslate_543',['pretranslate',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ae9be55c2f6f4d56b0878c983c0ff9cc6',1,'Eigen::Transform']]], - ['prev_544',['prev',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a028cc98d3aaca0dbbbbc3434572cce57',1,'cv::text::ERStat']]], - ['prev_5faround_5fdst_545',['PREV_AROUND_DST',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa35f844eeaa2817613fe40d436bc59e4a2256b56cf701d279a673dca2de0f1f96',1,'cv::Subdiv2D']]], - ['prev_5faround_5fleft_546',['PREV_AROUND_LEFT',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa35f844eeaa2817613fe40d436bc59e4acd1befba98e8c2956602923ac2e32f8f',1,'cv::Subdiv2D']]], - ['prev_5faround_5forg_547',['PREV_AROUND_ORG',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa35f844eeaa2817613fe40d436bc59e4a8170778bb0286aa463cae5232446008f',1,'cv::Subdiv2D']]], - ['prev_5faround_5fright_548',['PREV_AROUND_RIGHT',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa35f844eeaa2817613fe40d436bc59e4ae1d0ccf41e7cc6eadb9a26925fc25b18',1,'cv::Subdiv2D']]], - ['prev_5fpermutation_549',['prev_permutation',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga0b0e35a43f5f87ea1c66363be3a34619',1,'std::prev_permutation(_BidirectionalIterator __first, _BidirectionalIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga44e9b1d39001f68fa9fcb408b25a77f0',1,'std::prev_permutation(_BidirectionalIterator __first, _BidirectionalIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga0b0e35a43f5f87ea1c66363be3a34619',1,'prev_permutation(_BidirectionalIterator __first, _BidirectionalIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga44e9b1d39001f68fa9fcb408b25a77f0',1,'prev_permutation(_BidirectionalIterator __first, _BidirectionalIterator __last, _Compare __comp)(Global Namespace)']]], - ['prevallocator_550',['prevAllocator',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#aaefdaa34b364c74fa54c72da4a218384',1,'cv::UMatData']]], - ['preview_20based_20cv_20application_551',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], - ['prim_552',['Prim',['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html#ga990eafe0a1928eee6346bf863a21dc40',1,'cv::gapi::wip::draw::Prim'],['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html#ga990eafe0a1928eee6346bf863a21dc40',1,'Prim(Global Namespace)']]], - ['primitives_553',['Drawing primitives',['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html',1,'']]], - ['prims_554',['Prims',['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html#ga97ddfd7fca32bf5c1db56f25ab7d2b7e',1,'cv::gapi::wip::draw::Prims'],['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html#ga97ddfd7fca32bf5c1db56f25ab7d2b7e',1,'Prims(Global Namespace)']]], - ['principal_20component_20analysis_20pca_555',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], - ['principal_5fpoint_5fx_556',['principal_point_x',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#aebf2bea45d0b050c8517177aff3bbb6e',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['principal_5fpoint_5fy_557',['principal_point_y',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a4eb89feb3d0555da1931a4cf3fe79e04',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['print_558',['print',['https://docs.opencv.org/4.2.0/d8/d95/classcv_1_1videostab_1_1ILog.html#a86f2e9eee64228bfee3934337231c53e',1,'cv::videostab::ILog::print()'],['https://docs.opencv.org/4.2.0/d5/de0/classcv_1_1videostab_1_1LogToStdout.html#a4b76af16d16ab03db21deedcaf400358',1,'cv::videostab::LogToStdout::print()'],['https://docs.opencv.org/4.2.0/d6/d78/classcv_1_1videostab_1_1NullLog.html#a0c5e437e1b76d3af8630a24cf96163e9',1,'cv::videostab::NullLog::print()'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a701210a0203f2786cbfd04b2bd56da47',1,'cv::dnn::print()']]], - ['printattrs_559',['printAttrs',['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#a61186b9d6bf3e50a2643f5f95d9d01a2',1,'cv::CvHaarFeatureParams::printAttrs()'],['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html#a4f781c4db30a0816adcb3347c12fbec8',1,'cv::CvParams::printAttrs()']]], - ['printcudadeviceinfo_560',['printCudaDeviceInfo',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gaa37afdfb8efe85b6252ca2bb8bea8ff2',1,'cv::cuda::printCudaDeviceInfo()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gaa37afdfb8efe85b6252ca2bb8bea8ff2',1,'printCudaDeviceInfo()(Global Namespace)']]], - ['printdefaults_561',['printDefaults',['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#a456fc170d14e5a35c32d90b1cbf05552',1,'cv::CvHaarFeatureParams::printDefaults()'],['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html#a947f3edd9ebd435049ea64ad6719c3b0',1,'cv::CvParams::printDefaults()']]], - ['printerror_562',['printError',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#acdaf7dab7420e99efae1cc37cc9b399d',1,'cv::AVIReadContainer::printError(RiffList &list, unsigned int expected_fourcc)'],['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a9306c56efc696b968a931f7d3d266215',1,'cv::AVIReadContainer::printError(RiffChunk &chunk, unsigned int expected_fourcc)']]], - ['printerrors_563',['printErrors',['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#a70c31969ec5259b8c093d11a80c34f9f',1,'cv::CommandLineParser']]], - ['printfbuffersize_564',['printfBufferSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#abc5ce3dfc96d700aa85a908207fe948e',1,'cv::ocl::Device']]], - ['printmessage_565',['printMessage',['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#a84cda3794b765332bfe43bf8367222fb',1,'cv::CommandLineParser']]], - ['printpose_566',['printPose',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#aafb846e4bf0a2943ee751c59342ad630',1,'cv::ppf_match_3d::Pose3D']]], - ['printprogress_567',['printProgress',['https://docs.opencv.org/4.2.0/d1/dcc/structcv_1_1optflow_1_1GPCTrainingParams.html#a2c5256bc7c99e0ca2fd998cf129f5e8c',1,'cv::optflow::GPCTrainingParams']]], - ['printsetup_568',['printSetup',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a80d39a3463c206425e16ce85caa78d03',1,'cv::bioinspired::Retina::printSetup()'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#a064f6f85ff155551d545af64e8bcd05f',1,'cv::bioinspired::TransientAreasSegmentationModule::printSetup()']]], - ['printshortcudadeviceinfo_569',['printShortCudaDeviceInfo',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gacece2dc1d7962bcc7233c033fe64328b',1,'cv::cuda::printShortCudaDeviceInfo()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gacece2dc1d7962bcc7233c033fe64328b',1,'printShortCudaDeviceInfo()(Global Namespace)']]], - ['printumfpackcontrol_570',['printUmfpackControl',['https://eigen.tuxfamily.org/dox/classEigen_1_1UmfPackLU.html#a1e3543c0e6ae499e3d25f5a8a8f50623',1,'Eigen::UmfPackLU']]], - ['printumfpackinfo_571',['printUmfpackInfo',['https://eigen.tuxfamily.org/dox/classEigen_1_1UmfPackLU.html#a9b42dd0135fc9bcffec37f043022f135',1,'Eigen::UmfPackLU']]], - ['printumfpackstatus_572',['printUmfpackStatus',['https://eigen.tuxfamily.org/dox/classEigen_1_1UmfPackLU.html#aea06a54a1e4e8fc1ec522103825cc7b6',1,'Eigen::UmfPackLU']]], - ['prior_573',['prior',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#ac7c0cb49e5c7117bbde9243459670f12',1,'cv::optflow::OpticalFlowPCAFlow']]], - ['priorboxlayer_574',['PriorBoxLayer',['https://docs.opencv.org/4.2.0/da/d1e/classcv_1_1dnn_1_1PriorBoxLayer.html',1,'cv::dnn']]], - ['priority_5fqueue_575',['priority_queue',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11187.html',1,'__gnu_pbds::priority_queue< class, class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html',1,'std::priority_queue< _Tp, _Sequence, _Compare >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01534.html#gaa6332f0e852dc89f0879cb5408d168c0',1,'__gnu_pbds::priority_queue::priority_queue(const cmp_fn &r_cmp_fn)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01534.html#ga2b637d89cbd874881a4da920d57b0487',1,'__gnu_pbds::priority_queue::priority_queue(It first_it, It last_it)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01534.html#gad0141192206747833a170be548fd51e0',1,'__gnu_pbds::priority_queue::priority_queue(It first_it, It last_it, const cmp_fn &r_cmp_fn)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#ad9ef96e9ae20769410ce372f0f7c4f42',1,'std::priority_queue::priority_queue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#a83695f69303684e73b764c27d2da64d4',1,'std::priority_queue::priority_queue(_InputIterator __first, _InputIterator __last, const _Compare &__x, const _Sequence &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01534.html#gaa6332f0e852dc89f0879cb5408d168c0',1,'priority_queue(const cmp_fn &r_cmp_fn)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01534.html#ga2b637d89cbd874881a4da920d57b0487',1,'priority_queue(It first_it, It last_it)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01534.html#gad0141192206747833a170be548fd51e0',1,'priority_queue(It first_it, It last_it, const cmp_fn &r_cmp_fn)(Global Namespace)']]], - ['priority_5fqueue_2ehpp_576',['priority_queue.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01127.html',1,'']]], - ['priority_5fqueue_3c_20schedule_5ft_2c_20std_3a_3avector_3c_20schedule_5ft_20_3e_2c_20std_3a_3agreater_3c_20schedule_5ft_20_3e_20_3e_577',['priority_queue< schedule_t, std::vector< schedule_t >, std::greater< schedule_t > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html',1,'std']]], - ['priority_5fqueue_5fbase_5fdispatch_2ehpp_578',['priority_queue_base_dispatch.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01148.html',1,'']]], - ['priority_5fqueue_5ftag_579',['priority_queue_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11267.html',1,'__gnu_pbds']]], - ['priv_580',['priv',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#adbe25a8d4e35c2ed89fb53bd1f011200',1,'cv::gapi::fluid::Buffer::priv()'],['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#ac7d9575f460f9a1ada47f7118d317c94',1,'cv::gapi::fluid::Buffer::priv() const'],['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#a3bc9b0e7d2624b3b6c79e5598b31d369',1,'cv::detail::GArrayU::priv()'],['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#aa5ac43b89618d0378a0df9e34f24be31',1,'cv::detail::GArrayU::priv() const'],['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html#a52b60c5d248f265bf3a5295357ce48d2',1,'cv::gapi::GBackend::priv()'],['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html#a12fba7e51db326d0f58ea4503979db63',1,'cv::gapi::GBackend::priv() const'],['https://docs.opencv.org/4.2.0/dc/d02/classcv_1_1GCall.html#a19f861f39b3c6fbbc00cf9be165bfad1',1,'cv::GCall::priv()'],['https://docs.opencv.org/4.2.0/dc/d02/classcv_1_1GCall.html#a8fa2afa061d88a5cd0ce1548c2b7d1b0',1,'cv::GCall::priv() const'],['https://docs.opencv.org/4.2.0/df/daa/classcv_1_1GMat.html#aa1c3bc5e0f079e441ee625185fefa50c',1,'cv::GMat::priv()'],['https://docs.opencv.org/4.2.0/df/daa/classcv_1_1GMat.html#a8e8ece216852023d524729aa1112d86f',1,'cv::GMat::priv() const'],['https://docs.opencv.org/4.2.0/d9/d98/classcv_1_1GScalar.html#a5da63d5a7d3a0ccf01668cc7f57afd55',1,'cv::GScalar::priv()'],['https://docs.opencv.org/4.2.0/d9/d98/classcv_1_1GScalar.html#ab09d37dc122b93d0f197e23615d94372',1,'cv::GScalar::priv() const'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#a80658215aafc60ffa2ae6e8e2b3c804b',1,'cv::gapi::fluid::View::priv()'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#a395c7ec98ee8d58d5cee2ba3c2f6ad19',1,'cv::gapi::fluid::View::priv() const']]], - ['private_20implementation_20helpers_581',['Private implementation helpers',['https://docs.opencv.org/4.2.0/dd/d96/group__core__hal__intrin__impl.html',1,'']]], - ['private_2ecuda_2ehpp_582',['private.cuda.hpp',['https://docs.opencv.org/4.2.0/dc/d7a/private_8cuda_8hpp.html',1,'']]], - ['private_2ehpp_583',['private.hpp',['https://docs.opencv.org/4.2.0/d4/db2/modules_2core_2include_2opencv2_2core_2private_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d3c/contrib_2modules_2cudalegacy_2include_2opencv2_2cudalegacy_2private_8hpp.html',1,'(Global Namespace)']]], - ['prob_584',['prob',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#aa43b08b4dfbc551b19f1217f8c67f5ca',1,'cv::videostab::RansacParams']]], - ['probabilities_585',['probabilities',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a61e7fb7df1787577f1b0a94f07e3c1e3',1,'std::discrete_distribution']]], - ['probability_586',['probability',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a5134258df86ded2fbbcc1bb4b64e325c',1,'cv::text::ERStat']]], - ['probe_5ffn_5fbase_587',['probe_fn_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11743.html',1,'__gnu_pbds::detail']]], - ['probe_5ffn_5fbase_2ehpp_588',['probe_fn_base.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01325.html',1,'']]], - ['problems_20and_20decompositions_589',['Dense linear problems and decompositions',['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'']]], - ['process_590',['process',['https://docs.opencv.org/4.2.0/d4/df2/classcv_1_1AlignExposures.html#aa2379b2fb9629d779b6a54ad1cabfc1c',1,'cv::AlignExposures::process()'],['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a5f565da5f84500aa5915906a2698ecfe',1,'cv::AlignMTB::process(InputArrayOfArrays src, std::vector< Mat > &dst, InputArray times, InputArray response) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a37b3417d844f362d781f34155cbcb201',1,'cv::AlignMTB::process(InputArrayOfArrays src, std::vector< Mat > &dst)=0'],['https://docs.opencv.org/4.2.0/dd/de3/classcv_1_1CalibrateCRF.html#a7bd220808762094e0b48819f63437196',1,'cv::CalibrateCRF::process()'],['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a04010a77df58e838a781889eb4edd303',1,'cv::DetectionBasedTracker::process()'],['https://docs.opencv.org/4.2.0/d9/dbb/classcv_1_1videostab_1_1IOutlierRejector.html#a7d49112305864ffad1e47cc5057c2e89',1,'cv::videostab::IOutlierRejector::process()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a5a0202bf2ac201d5bbfcac2a48a926dd',1,'cv::tbm::ITrackerByMatching::process()'],['https://docs.opencv.org/4.2.0/df/d62/classcv_1_1MergeDebevec.html#adf18c10c2edf68b6a8141eb972b2e860',1,'cv::MergeDebevec::process(InputArrayOfArrays src, OutputArray dst, InputArray times, InputArray response) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/df/d62/classcv_1_1MergeDebevec.html#aca5d520352e06b99754c1b5a6d88b58d',1,'cv::MergeDebevec::process(InputArrayOfArrays src, OutputArray dst, InputArray times)=0'],['https://docs.opencv.org/4.2.0/d6/d5e/classcv_1_1MergeExposures.html#a547fe61891e611804b27a3f5ef0237ee',1,'cv::MergeExposures::process()'],['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html#ad6942f44b46efb5d0c6571179bfd9d48',1,'cv::MergeMertens::process(InputArrayOfArrays src, OutputArray dst, InputArray times, InputArray response) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html#a2d2254b2aab722c16954de13a663644d',1,'cv::MergeMertens::process(InputArrayOfArrays src, OutputArray dst)=0'],['https://docs.opencv.org/4.2.0/d7/d5b/classcv_1_1MergeRobertson.html#ac3657dcff146fe595329771783901b85',1,'cv::MergeRobertson::process(InputArrayOfArrays src, OutputArray dst, InputArray times, InputArray response) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d7/d5b/classcv_1_1MergeRobertson.html#ace4e270491b2e5a4cfa8fb1dd7f243a8',1,'cv::MergeRobertson::process(InputArrayOfArrays src, OutputArray dst, InputArray times)=0'],['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html#a62fc60996f8d3e30a96ee8a078e1c57b',1,'cv::linemod::Modality::process()'],['https://docs.opencv.org/4.2.0/d3/de9/classcv_1_1videostab_1_1NullOutlierRejector.html#a7f558f1e76d7f7db2ec272ceaf853dc9',1,'cv::videostab::NullOutlierRejector::process()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga5644f68f1105873b1678e0ba81d89988',1,'cv::stereo::QuasiDenseStereo::process()'],['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a549392ce4be81801262830e09e64dbf0',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation::process()'],['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#ade5839ec71229a08257c560afd7db907',1,'cv::detail::Timelapser::process()'],['https://docs.opencv.org/4.2.0/d8/d5e/classcv_1_1Tonemap.html#aa705c3b7226f7028a5c117dffab60fe4',1,'cv::Tonemap::process()'],['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a665d61ddbe148114cfcfe8dc36d3f53e',1,'cv::videostab::TranslationBasedLocalOutlierRejector::process()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga5644f68f1105873b1678e0ba81d89988',1,'process()(Global Namespace)']]], - ['processimage_591',['processImage',['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1ximgproc_1_1segmentation_1_1GraphSegmentation.html#a13a3603cb371d740c3c4b01d63553d90',1,'cv::ximgproc::segmentation::GraphSegmentation']]], - ['processimage_3a_592',['processImage:',['https://docs.opencv.org/4.2.0/d3/d54/protocolCvVideoCameraDelegate_01-p.html#a3ac80584d3c5d95f6e694af160ed4eb7',1,'CvVideoCameraDelegate -p-p']]], - ['processimpl_593',['processImpl',['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a82d035855d8fd9719e3d27d1d1e25660',1,'cv::linemod::ColorGradient::processImpl()'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a1aa7e852dc6e942ba83c14b72e2d16d3',1,'cv::linemod::DepthNormal::processImpl()'],['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html#a7d1218566fa5ceb3d0358f3c3d467c12',1,'cv::linemod::Modality::processImpl()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ab891ad01fa46db6bdb8f6b3277390b75',1,'cv::superres::SuperResolution::processImpl()']]], - ['processing_594',['processing',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html',1,'Color space processing'],['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'Discovering the human retina and its use for image processing']]], - ['processing_595',['Extended Image Processing',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html',1,'']]], - ['processing_596',['Fuzzy image processing',['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html',1,'']]], - ['processing_597',['Processing',['https://docs.opencv.org/4.2.0/d7/dbd/group__imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d2/df0/tutorial_js_table_of_contents_imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html',1,'NPPST Image Processing'],['https://docs.opencv.org/4.2.0/de/d25/group__npps.html',1,'NPPST Signal Processing'],['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'OpenCV iOS - Image Processing'],['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'OpenCV iOS - Video Processing'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html',1,'RGB-Depth Processing']]], - ['processing_20algorithms_598',['Additional photo processing algorithms',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html',1,'']]], - ['processing_20based_20on_20fuzzy_20mathematics_599',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], - ['processing_20for_20video_20capture_600',['Image Processing for Video Capture',['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'']]], - ['processing_20functionality_601',['G-API Image processing functionality',['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'']]], - ['processing_20images_20causing_20optical_20illusions_602',['Processing images causing optical illusions',['https://docs.opencv.org/4.2.0/d7/d8f/tutorial_bioinspired_retina_illusion.html',1,'']]], - ['processing_20imgproc_20module_603',['Image Processing (imgproc module)',['https://docs.opencv.org/4.2.0/d7/da8/tutorial_table_of_content_imgproc.html',1,'']]], - ['processing_20in_20opencv_604',['Image Processing in OpenCV',['https://docs.opencv.org/4.2.0/d2/d96/tutorial_py_table_of_contents_imgproc.html',1,'']]], - ['processing_20tutorials_605',['Fuzzy image processing tutorials',['https://docs.opencv.org/4.2.0/d7/d36/tutorial_fuzzy.html',1,'']]], - ['processingstarttime_5f_606',['processingStartTime_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a8debf88a6cab45a8b09035584815f5bd',1,'cv::videostab::StabilizerBase']]], - ['processnoisecov_607',['processNoiseCov',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#af19be9c0630d0f658bdbaea409a35cda',1,'cv::KalmanFilter::processNoiseCov'],['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a2f42ad9a10e19dd30b63951874cb1993',1,'cv::tracking::UnscentedKalmanFilterParams::processNoiseCov']]], - ['prod_608',['prod',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af119d9a4efe5a15cd83c1ccdf01b3a4f',1,'Eigen::DenseBase::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af119d9a4efe5a15cd83c1ccdf01b3a4f',1,'DenseBase< ArrayWrapper< ExpressionType > >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af119d9a4efe5a15cd83c1ccdf01b3a4f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af119d9a4efe5a15cd83c1ccdf01b3a4f',1,'DenseBase< Solve< Decomposition, RhsType > >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'Eigen::VectorwiseOp::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const Derived, Horizontal >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const Derived, Vertical >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::prod()']]], - ['product_609',['Product',['https://eigen.tuxfamily.org/dox/classEigen_1_1Product.html',1,'Eigen']]], - ['product_20expressions_610',['Writing efficient matrix product expressions',['https://eigen.tuxfamily.org/dox/TopicWritingEfficientProductExpression.html',1,'']]], - ['profile_2fbase_2eh_611',['profile/base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16604.html',1,'']]], - ['profile_2fbitset_612',['profile/bitset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16613.html',1,'']]], - ['profile_2fdeque_613',['profile/deque',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16805.html',1,'']]], - ['profile_2fforward_5flist_614',['profile/forward_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16907.html',1,'']]], - ['profile_2flist_615',['profile/list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17060.html',1,'']]], - ['profile_2fmap_616',['profile/map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17069.html',1,'']]], - ['profile_2fmap_2eh_617',['profile/map.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17078.html',1,'']]], - ['profile_2fmultimap_2eh_618',['profile/multimap.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17090.html',1,'']]], - ['profile_2fmultiset_2eh_619',['profile/multiset.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17096.html',1,'']]], - ['profile_2fset_620',['profile/set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17216.html',1,'']]], - ['profile_2fset_2eh_621',['profile/set.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17225.html',1,'']]], - ['profile_2funordered_5fmap_622',['profile/unordered_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17336.html',1,'']]], - ['profile_2funordered_5fset_623',['profile/unordered_set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17345.html',1,'']]], - ['profile_2fvector_624',['profile/vector',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17357.html',1,'']]], - ['profilelevel_625',['ProfileLevel',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a78a8efb81e3ebf8464b6b437347dbe9d',1,'cv::cudacodec::EncoderParams']]], - ['profiler_2eh_626',['profiler.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00824.html',1,'']]], - ['profiler_5falgos_2eh_627',['profiler_algos.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00827.html',1,'']]], - ['profiler_5fcontainer_5fsize_2eh_628',['profiler_container_size.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00830.html',1,'']]], - ['profiler_5fhash_5ffunc_2eh_629',['profiler_hash_func.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00833.html',1,'']]], - ['profiler_5fhashtable_5fsize_2eh_630',['profiler_hashtable_size.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00836.html',1,'']]], - ['profiler_5flist_5fto_5fslist_2eh_631',['profiler_list_to_slist.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00839.html',1,'']]], - ['profiler_5flist_5fto_5fvector_2eh_632',['profiler_list_to_vector.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00842.html',1,'']]], - ['profiler_5fmap_5fto_5funordered_5fmap_2eh_633',['profiler_map_to_unordered_map.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00845.html',1,'']]], - ['profiler_5fnode_2eh_634',['profiler_node.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00848.html',1,'']]], - ['profiler_5fstate_2eh_635',['profiler_state.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00851.html',1,'']]], - ['profiler_5ftrace_2eh_636',['profiler_trace.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00854.html',1,'']]], - ['profiler_5fvector_5fsize_2eh_637',['profiler_vector_size.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00857.html',1,'']]], - ['profiler_5fvector_5fto_5flist_2eh_638',['profiler_vector_to_list.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00860.html',1,'']]], - ['profilingtimerresolution_639',['profilingTimerResolution',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#adb4347c68d8d00a71f43d97001c2317c',1,'cv::ocl::Device']]], - ['program_640',['Program',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html',1,'cv::ocl::Program'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a5cda416295d66e370dd288a800d39c05',1,'cv::ocl::Program::Program()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a35356fa973803991f9ebcefdf9cc61b1',1,'cv::ocl::Program::Program(const ProgramSource &src, const String &buildflags, String &errmsg)'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a5c50073baeb930dd9c42b5eaafd4ca0b',1,'cv::ocl::Program::Program(const Program &prog)']]], - ['programs_641',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], - ['programsource_642',['ProgramSource',['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html',1,'cv::ocl::ProgramSource'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a00ba4e2e29ab3ccd6d7f199353ab7b86',1,'cv::ocl::ProgramSource::ProgramSource()'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a689ea52f5cf8764ad2f1cee059fd8deb',1,'cv::ocl::ProgramSource::ProgramSource(const String &module, const String &name, const String &codeStr, const String &codeHash)'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a3ed31c460b18b357141da02992948aa9',1,'cv::ocl::ProgramSource::ProgramSource(const String &prog)'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a6be45d80a058e0ab2f708bdb147e47cf',1,'cv::ocl::ProgramSource::ProgramSource(const char *prog)'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a9a3b4acc6de763477f9b039125a26dbf',1,'cv::ocl::ProgramSource::ProgramSource(const ProgramSource &prog)']]], - ['proj_5fspherical_5feqrect_643',['PROJ_SPHERICAL_EQRECT',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggace497823594b601f2094d32dde6a3c94a62d8708c29117854d6903d8e1155d8c0',1,'cv::PROJ_SPHERICAL_EQRECT'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggace497823594b601f2094d32dde6a3c94a62d8708c29117854d6903d8e1155d8c0',1,'PROJ_SPHERICAL_EQRECT(Global Namespace)']]], - ['proj_5fspherical_5fortho_644',['PROJ_SPHERICAL_ORTHO',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggace497823594b601f2094d32dde6a3c94aad55e201c84b7c538455a69153d5e676',1,'cv::PROJ_SPHERICAL_ORTHO'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggace497823594b601f2094d32dde6a3c94aad55e201c84b7c538455a69153d5e676',1,'PROJ_SPHERICAL_ORTHO(Global Namespace)']]], - ['project_645',['project',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1face_1_1FacemarkLBF_1_1BBox.html#a5516967ef0ca522b9b183ae05907bdc3',1,'cv::face::FacemarkLBF::BBox::project()'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#ac8b4067465dda3972a74d4f15ef1087c',1,'cv::LDA::project()'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a67c9a3f8fe804f40be58c88a3ae73f41',1,'cv::PCA::project(InputArray vec) const'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a0d02b263028cdf5267229f334020c632',1,'cv::PCA::project(InputArray vec, OutputArray result) const']]], - ['project1st_646',['project1st',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09187.html',1,'__gnu_cxx::project1st< class, class >'],['https://docs.opencv.org/4.2.0/d3/dea/structcv_1_1cudev_1_1project1st.html',1,'cv::cudev::project1st< class, class >']]], - ['project2nd_647',['project2nd',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09191.html',1,'__gnu_cxx::project2nd< class, class >'],['https://docs.opencv.org/4.2.0/d2/dd5/structcv_1_1cudev_1_1project2nd.html',1,'cv::cudev::project2nd< class, class >']]], - ['projection_648',['Back Projection',['https://docs.opencv.org/4.2.0/da/d7f/tutorial_back_projection.html',1,'']]], - ['projection_649',['projection',['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a855dec52efed47121fc5cd47fdf808f7',1,'Eigen::Hyperplane::projection()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a37c3fe8af9a90adce20b1f6ee62c04ea',1,'Eigen::ParametrizedLine::projection()']]], - ['projection_650',['Projection',['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html',1,'']]], - ['projection_2ehpp_651',['projection.hpp',['https://docs.opencv.org/4.2.0/d0/dbd/projection_8hpp.html',1,'']]], - ['projectionfromkrt_652',['projectionFromKRt',['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#ga2daa5a23fd362c8950ff9256c690fed8',1,'cv::sfm::projectionFromKRt()'],['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#ga2daa5a23fd362c8950ff9256c690fed8',1,'projectionFromKRt()(Global Namespace)']]], - ['projectionsfromfundamental_653',['projectionsFromFundamental',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gae29b41e17673893a3fb0ed6c38f2d23e',1,'cv::sfm::projectionsFromFundamental()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gae29b41e17673893a3fb0ed6c38f2d23e',1,'projectionsFromFundamental()(Global Namespace)']]], - ['projective_654',['Projective',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaee59a86102f150923b0cac6d4ff05107a0f7338b8672884554e8642bce9e44183',1,'Eigen::Projective'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaee59a86102f150923b0cac6d4ff05107a0f7338b8672884554e8642bce9e44183',1,'Projective(Global Namespace)']]], - ['projector_5f_655',['projector_',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'cv::detail::RotationWarperBase::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< CompressedRectilinearPortraitProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< CompressedRectilinearProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< CylindricalPortraitProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< CylindricalProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< FisheyeProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< MercatorProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< PaniniPortraitProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< PaniniProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< PlanePortraitProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< PlaneProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< SphericalPortraitProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< SphericalProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< StereographicProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< TransverseMercatorProjector >::projector_']]], - ['projectorbase_656',['ProjectorBase',['https://docs.opencv.org/4.2.0/dc/d2c/structcv_1_1detail_1_1ProjectorBase.html',1,'cv::detail']]], - ['projectpoints_657',['projectPoints',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga1019495a2c8d1743ed5cc23fa0daff8c',1,'cv::projectPoints()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gabf8ec08fb71c5c3402cf7bb72e078d43',1,'cv::cuda::projectPoints()'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gab1ad1dc30c42ee1a50ce570019baf2c4',1,'cv::fisheye::projectPoints(InputArray objectPoints, OutputArray imagePoints, const Affine3d &affine, InputArray K, InputArray D, double alpha=0, OutputArray jacobian=noArray())'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga719a1b99cd5cb1fec92d0d1aedbb6841',1,'cv::fisheye::projectPoints(InputArray objectPoints, OutputArray imagePoints, InputArray rvec, InputArray tvec, InputArray K, InputArray D, double alpha=0, OutputArray jacobian=noArray())'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gaa56e2e41ffcca9aaf9862279066778de',1,'cv::omnidir::projectPoints()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga1019495a2c8d1743ed5cc23fa0daff8c',1,'projectPoints(InputArray objectPoints, InputArray rvec, InputArray tvec, InputArray cameraMatrix, InputArray distCoeffs, OutputArray imagePoints, OutputArray jacobian=noArray(), double aspectRatio=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gab1ad1dc30c42ee1a50ce570019baf2c4',1,'projectPoints(InputArray objectPoints, OutputArray imagePoints, const Affine3d &affine, InputArray K, InputArray D, double alpha=0, OutputArray jacobian=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga719a1b99cd5cb1fec92d0d1aedbb6841',1,'projectPoints(InputArray objectPoints, OutputArray imagePoints, InputArray rvec, InputArray tvec, InputArray K, InputArray D, double alpha=0, OutputArray jacobian=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gaa56e2e41ffcca9aaf9862279066778de',1,'projectPoints(InputArray objectPoints, OutputArray imagePoints, InputArray rvec, InputArray tvec, InputArray K, double xi, InputArray D, OutputArray jacobian=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gabf8ec08fb71c5c3402cf7bb72e078d43',1,'projectPoints(const GpuMat &src, const Mat &rvec, const Mat &tvec, const Mat &camera_mat, const Mat &dist_coef, GpuMat &dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['projects_658',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], - ['projects_659',['Using Eigen in CMake Projects',['https://eigen.tuxfamily.org/dox/TopicCMakeGuide.html',1,'']]], - ['promise_660',['promise',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02251.html',1,'std']]], - ['promise_3c_20_5fres_20_26_20_3e_661',['promise< _Res & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02371.html',1,'std']]], - ['promise_3c_20void_20_3e_662',['promise< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02375.html',1,'std']]], - ['promise_5falready_5fsatisfied_663',['promise_already_satisfied',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a9327d6f7b9aca59b62b436696fd17a00',1,'promise_already_satisfied(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a9327d6f7b9aca59b62b436696fd17a00',1,'promise_already_satisfied(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a9327d6f7b9aca59b62b436696fd17a00',1,'promise_already_satisfied(Global Namespace)']]], - ['propagate_5fconst_664',['propagate_const',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10135.html',1,'std::experimental::fundamentals_v2::propagate_const< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01019.html',1,'(Global Namespace)']]], - ['propagate_5fon_5fcontainer_5fcopy_5fassignment_665',['propagate_on_container_copy_assignment',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#acd5ad3d84299a655ad2c59e2345b7796',1,'__alloc_traits< _Tp_alloc_type >::propagate_on_container_copy_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#acd5ad3d84299a655ad2c59e2345b7796',1,'__gnu_cxx::__alloc_traits::propagate_on_container_copy_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#acd5ad3d84299a655ad2c59e2345b7796',1,'allocator_traits< _Tp_alloc_type >::propagate_on_container_copy_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#acd5ad3d84299a655ad2c59e2345b7796',1,'std::allocator_traits::propagate_on_container_copy_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#aead0578ced7c066e9a89d1cb5825c5df',1,'std::allocator_traits< allocator< _Tp > >::propagate_on_container_copy_assignment']]], - ['propagate_5fon_5fcontainer_5fmove_5fassignment_666',['propagate_on_container_move_assignment',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a1db75f5aec19020544743134c961f607',1,'__alloc_traits< _Tp_alloc_type >::propagate_on_container_move_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a1db75f5aec19020544743134c961f607',1,'__gnu_cxx::__alloc_traits::propagate_on_container_move_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a1db75f5aec19020544743134c961f607',1,'allocator_traits< _Tp_alloc_type >::propagate_on_container_move_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a1db75f5aec19020544743134c961f607',1,'std::allocator_traits::propagate_on_container_move_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#ab636a9fa7ab57a25ec043f171371976f',1,'std::allocator_traits< allocator< _Tp > >::propagate_on_container_move_assignment']]], - ['propagate_5fon_5fcontainer_5fswap_667',['propagate_on_container_swap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#adad7997e545350e38d1b44d01568741a',1,'__alloc_traits< _Tp_alloc_type >::propagate_on_container_swap'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#adad7997e545350e38d1b44d01568741a',1,'__gnu_cxx::__alloc_traits::propagate_on_container_swap'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#adad7997e545350e38d1b44d01568741a',1,'allocator_traits< _Tp_alloc_type >::propagate_on_container_swap'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#adad7997e545350e38d1b44d01568741a',1,'std::allocator_traits::propagate_on_container_swap'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a37863f3ca5e214592282792a1741219f',1,'std::allocator_traits< allocator< _Tp > >::propagate_on_container_swap']]], - ['propagatefast_668',['PropagateFast',['https://eigen.tuxfamily.org/dox/group__enums.html#gga7f4e3f96895bdb325eab1a0b651e211fa917fa8982b7eb0cbb440d38ee50e0b9c',1,'Eigen::PropagateFast'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga7f4e3f96895bdb325eab1a0b651e211fa917fa8982b7eb0cbb440d38ee50e0b9c',1,'PropagateFast(Global Namespace)']]], - ['propagatenan_669',['PropagateNaN',['https://eigen.tuxfamily.org/dox/group__enums.html#gga7f4e3f96895bdb325eab1a0b651e211fa1d414f9966ecba69cd840b8def472c4a',1,'Eigen::PropagateNaN'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga7f4e3f96895bdb325eab1a0b651e211fa1d414f9966ecba69cd840b8def472c4a',1,'PropagateNaN(Global Namespace)']]], - ['propagatenumbers_670',['PropagateNumbers',['https://eigen.tuxfamily.org/dox/group__enums.html#gga7f4e3f96895bdb325eab1a0b651e211fa5bfaff916ad4913fd04fe2e92c5c32ae',1,'Eigen::PropagateNumbers'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga7f4e3f96895bdb325eab1a0b651e211fa5bfaff916ad4913fd04fe2e92c5c32ae',1,'PropagateNumbers(Global Namespace)']]], - ['propagating_20wrapper_671',['Const-propagating wrapper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01526.html',1,'']]], - ['propagationparameters_672',['PropagationParameters',['https://docs.opencv.org/4.2.0/de/dfc/structcv_1_1stereo_1_1PropagationParameters.html',1,'cv::stereo']]], - ['properties_673',['Properties',['https://docs.opencv.org/4.2.0/d1/d32/tutorial_py_contour_properties.html',1,'Contour Properties'],['https://docs.opencv.org/4.2.0/da/dc1/tutorial_js_contour_properties.html',1,'Contour Properties']]], - ['proposallayer_674',['ProposalLayer',['https://docs.opencv.org/4.2.0/da/d6b/classcv_1_1dnn_1_1ProposalLayer.html',1,'cv::dnn']]], - ['prototometa_675',['ProtoToMeta',['https://docs.opencv.org/4.2.0/dd/ddb/structcv_1_1detail_1_1ProtoToMeta.html',1,'cv::detail']]], - ['prototometa_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_676',['ProtoToMeta< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/dd/d51/structcv_1_1detail_1_1ProtoToMeta_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], - ['prototometa_3c_20cv_3a_3agmat_20_3e_677',['ProtoToMeta< cv::GMat >',['https://docs.opencv.org/4.2.0/d0/d99/structcv_1_1detail_1_1ProtoToMeta_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], - ['prototometa_3c_20cv_3a_3agscalar_20_3e_678',['ProtoToMeta< cv::GScalar >',['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1detail_1_1ProtoToMeta_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], - ['prototometat_679',['ProtoToMetaT',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a46e15ae8b51789699cbd73c6f25d736e',1,'cv::detail']]], - ['prototoparam_680',['ProtoToParam',['https://docs.opencv.org/4.2.0/dd/dc5/structcv_1_1detail_1_1ProtoToParam.html',1,'cv::detail']]], - ['prototoparam_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_681',['ProtoToParam< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/d5/d57/structcv_1_1detail_1_1ProtoToParam_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], - ['prototoparam_3c_20cv_3a_3agmat_20_3e_682',['ProtoToParam< cv::GMat >',['https://docs.opencv.org/4.2.0/dc/dc8/structcv_1_1detail_1_1ProtoToParam_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], - ['prototoparam_3c_20cv_3a_3agscalar_20_3e_683',['ProtoToParam< cv::GScalar >',['https://docs.opencv.org/4.2.0/de/d65/structcv_1_1detail_1_1ProtoToParam_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], - ['prototoparamt_684',['ProtoToParamT',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a8832b78b39ecff459d1d91a371c7a8b3',1,'cv::detail']]], - ['prune_685',['prune',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0e5f8cc59ee57207f0cff6b142bcdd0d',1,'Eigen::SparseMatrix::prune(const KeepFunc &keep=KeepFunc())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a08af03b2fc6c371c8be4fcd62509288c',1,'Eigen::SparseMatrix::prune(const Scalar &reference, const RealScalar &epsilon=NumTraits< RealScalar >::dummy_precision())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0e5f8cc59ee57207f0cff6b142bcdd0d',1,'SparseMatrix< Scalar >::prune(const KeepFunc &keep=KeepFunc())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a08af03b2fc6c371c8be4fcd62509288c',1,'SparseMatrix< Scalar >::prune(const Scalar &reference, const RealScalar &epsilon=NumTraits< RealScalar >::dummy_precision())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0e5f8cc59ee57207f0cff6b142bcdd0d',1,'SparseMatrix< Scalar, ColMajor, int >::prune(const KeepFunc &keep=KeepFunc())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a08af03b2fc6c371c8be4fcd62509288c',1,'SparseMatrix< Scalar, ColMajor, int >::prune(const Scalar &reference, const RealScalar &epsilon=NumTraits< RealScalar >::dummy_precision())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0e5f8cc59ee57207f0cff6b142bcdd0d',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::prune(const KeepFunc &keep=KeepFunc())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a08af03b2fc6c371c8be4fcd62509288c',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::prune(const Scalar &reference, const RealScalar &epsilon=NumTraits< RealScalar >::dummy_precision())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0e5f8cc59ee57207f0cff6b142bcdd0d',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::prune(const KeepFunc &keep=KeepFunc())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a08af03b2fc6c371c8be4fcd62509288c',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::prune(const Scalar &reference, const RealScalar &epsilon=NumTraits< RealScalar >::dummy_precision())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#a2304bf75c891bcf5545783d5eb3284ed',1,'Eigen::SparseVector::prune()']]], - ['pruned_686',['pruned',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac8d0414b56d9d620ce9a698c1b281e5d',1,'Eigen::SparseMatrixBase::pruned()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac8d0414b56d9d620ce9a698c1b281e5d',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::pruned()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac8d0414b56d9d620ce9a698c1b281e5d',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::pruned()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac8d0414b56d9d620ce9a698c1b281e5d',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::pruned()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac8d0414b56d9d620ce9a698c1b281e5d',1,'SparseMatrixBase< Transpose< MatrixType > >::pruned()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac8d0414b56d9d620ce9a698c1b281e5d',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::pruned()']]], - ['ps_687',['ps',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a09c03d881042a98a2e2a751bf2f5531d',1,'cv::dnn::DictValue']]], - ['pseudoeigenvaluematrix_688',['pseudoEigenvalueMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a4979eafe0aeef06b19ada7fa5e19db17',1,'Eigen::EigenSolver']]], - ['pseudoeigenvectors_689',['pseudoEigenvectors',['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a4e796226f06e1f7347cf03a38755a155',1,'Eigen::EigenSolver']]], - ['pseudoinverse_690',['pseudoInverse',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a3c89639299720ce089435d26d6822d6f',1,'Eigen::CompleteOrthogonalDecomposition']]], - ['psm_5fauto_691',['PSM_AUTO',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba592c3b182ce902537d8aaed3e00d4d8c',1,'cv::text::PSM_AUTO'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba592c3b182ce902537d8aaed3e00d4d8c',1,'PSM_AUTO(Global Namespace)']]], - ['psm_5fauto_5fonly_692',['PSM_AUTO_ONLY',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba941826c53c13b78c57cb79d2a66062bc',1,'cv::text::PSM_AUTO_ONLY'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba941826c53c13b78c57cb79d2a66062bc',1,'PSM_AUTO_ONLY(Global Namespace)']]], - ['psm_5fauto_5fosd_693',['PSM_AUTO_OSD',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba45394fc9b8bcf757170c7951aa0a833c',1,'cv::text::PSM_AUTO_OSD'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba45394fc9b8bcf757170c7951aa0a833c',1,'PSM_AUTO_OSD(Global Namespace)']]], - ['psm_5fcircle_5fword_694',['PSM_CIRCLE_WORD',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba7086bc9fce731b1a2804aa15a118ec97',1,'cv::text::PSM_CIRCLE_WORD'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba7086bc9fce731b1a2804aa15a118ec97',1,'PSM_CIRCLE_WORD(Global Namespace)']]], - ['psm_5fosd_5fonly_695',['PSM_OSD_ONLY',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba7f263fe084bd2b66918ca1b8828c7f7d',1,'cv::text::PSM_OSD_ONLY'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba7f263fe084bd2b66918ca1b8828c7f7d',1,'PSM_OSD_ONLY(Global Namespace)']]], - ['psm_5fsingle_5fblock_696',['PSM_SINGLE_BLOCK',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576baa3e77010118ac2ec965fa9b0bb55bbc8',1,'cv::text::PSM_SINGLE_BLOCK'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576baa3e77010118ac2ec965fa9b0bb55bbc8',1,'PSM_SINGLE_BLOCK(Global Namespace)']]], - ['psm_5fsingle_5fblock_5fvert_5ftext_697',['PSM_SINGLE_BLOCK_VERT_TEXT',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba9df2b8ca6b05b6c4595d63ffe1ed5d65',1,'cv::text::PSM_SINGLE_BLOCK_VERT_TEXT'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba9df2b8ca6b05b6c4595d63ffe1ed5d65',1,'PSM_SINGLE_BLOCK_VERT_TEXT(Global Namespace)']]], - ['psm_5fsingle_5fchar_698',['PSM_SINGLE_CHAR',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba31569ebd7f6f05aa73ab1021622377e4',1,'cv::text::PSM_SINGLE_CHAR'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba31569ebd7f6f05aa73ab1021622377e4',1,'PSM_SINGLE_CHAR(Global Namespace)']]], - ['psm_5fsingle_5fcolumn_699',['PSM_SINGLE_COLUMN',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba12b616117a78aed4be8eb43cc5f3266a',1,'cv::text::PSM_SINGLE_COLUMN'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba12b616117a78aed4be8eb43cc5f3266a',1,'PSM_SINGLE_COLUMN(Global Namespace)']]], - ['psm_5fsingle_5fline_700',['PSM_SINGLE_LINE',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba7e8598b350f3caf72196e723e5b210e3',1,'cv::text::PSM_SINGLE_LINE'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba7e8598b350f3caf72196e723e5b210e3',1,'PSM_SINGLE_LINE(Global Namespace)']]], - ['psm_5fsingle_5fword_701',['PSM_SINGLE_WORD',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba66b6336634f7fa1f726d7c1fc30b811e',1,'cv::text::PSM_SINGLE_WORD'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba66b6336634f7fa1f726d7c1fc30b811e',1,'PSM_SINGLE_WORD(Global Namespace)']]], - ['psnr_702',['PSNR',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3119e3ea73010a6f810bb05aa36ac8d6',1,'cv::PSNR()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3119e3ea73010a6f810bb05aa36ac8d6',1,'PSNR()(Global Namespace)']]], - ['psp_703',['PSP',['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html#gga06e837be12dab197606d1155a8b94025a1642d3774551cc6161f49359cc4dd3af',1,'cv::structured_light::PSP'],['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html#gga06e837be12dab197606d1155a8b94025a1642d3774551cc6161f49359cc4dd3af',1,'PSP(Global Namespace)']]], - ['psr_5fthreshold_704',['psr_threshold',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a7ff9f25f5740f44446b5df02880f46db',1,'cv::TrackerCSRT::Params']]], - ['psrcframe0_705',['pSrcFrame0',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a398a28ba1e7af34471d940b0690d8cae',1,'NppStInterpolationState']]], - ['psrcframe1_706',['pSrcFrame1',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#afbfa0c057c3ce565a66b8a153a6b8d7b',1,'NppStInterpolationState']]], - ['psroioutchannels_707',['psRoiOutChannels',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a4310e0b49d2e862fed6656c87d42a0a8',1,'cv::dnn::PoolingLayer']]], - ['pt_708',['pt',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a9502f2f63fc1d4d15d10730359e750f5',1,'cv::line_descriptor::KeyLine::pt'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#ae6b87d798d3e181a472b08fa33883abe',1,'cv::KeyPoint::pt'],['https://docs.opencv.org/4.2.0/d4/dbc/structcv_1_1Subdiv2D_1_1QuadEdge.html#acb6f3f8fbce5e5bd0f9db093c22c5cad',1,'cv::Subdiv2D::QuadEdge::pt'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#af7c97e4007500c064872ea46d0bab26b',1,'cv::Subdiv2D::Vertex::pt']]], - ['pt1_709',['pt1',['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#a0e00f31263cdee3b28c02db8725bf7b5',1,'cv::gapi::wip::draw::Line']]], - ['pt2_710',['pt2',['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#a6373d437d78b2868f3ecdae6ee01b9f5',1,'cv::gapi::wip::draw::Line']]], - ['ptloc_5ferror_711',['PTLOC_ERROR',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1f6cf51be5842d9cf1323b4231f07597a250bb6debdc855cc6bc204454f516d3b',1,'cv::Subdiv2D']]], - ['ptloc_5finside_712',['PTLOC_INSIDE',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1f6cf51be5842d9cf1323b4231f07597ae417a0101ccdd133278862bc7e6dcea0',1,'cv::Subdiv2D']]], - ['ptloc_5fon_5fedge_713',['PTLOC_ON_EDGE',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1f6cf51be5842d9cf1323b4231f07597adce5c8dff4cd9e6c2e0060dbc9a6f3b6',1,'cv::Subdiv2D']]], - ['ptloc_5foutside_5frect_714',['PTLOC_OUTSIDE_RECT',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1f6cf51be5842d9cf1323b4231f07597a79867dca35f0d88ad21969460b533ae1',1,'cv::Subdiv2D']]], - ['ptloc_5fvertex_715',['PTLOC_VERTEX',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1f6cf51be5842d9cf1323b4231f07597ac78fcef37382840c75b46eb06af11350',1,'cv::Subdiv2D']]], - ['ptr_716',['Ptr',['https://docs.opencv.org/4.2.0/da/d03/classcv_1_1gapi_1_1wip_1_1IStreamSource.html#afa9caf180bca701df9b10a6974eaa8ff',1,'cv::gapi::wip::IStreamSource']]], - ['ptr_717',['ptr',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a194ac92b66c003787e0782bd8a38750b',1,'cv::AutoBuffer::ptr'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a194ac92b66c003787e0782bd8a38750b',1,'AutoBuffer< double, 1 >::ptr'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a194ac92b66c003787e0782bd8a38750b',1,'AutoBuffer< int64, 1 >::ptr'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a194ac92b66c003787e0782bd8a38750b',1,'AutoBuffer< String, 1 >::ptr'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a9fc3f91adc5a20c6841c083cc89178d3',1,'cv::LineIterator::ptr'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a5904a30e2069349bca792b54dcf02de7',1,'cv::MatConstIterator::ptr'],['https://docs.opencv.org/4.2.0/d6/d86/structNCVMemPtr.html#a7d7da54f1b3c34b8867c51520150118e',1,'NCVMemPtr::ptr'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a436e094b8015b0d904efca35186f21d6',1,'cv::SparseMatConstIterator::ptr'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#acfd4507921bb1de80e41b7d39b3d73ce',1,'cv::ocl::Context::ptr()'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a8640958194e2448f958983a808dc4e36',1,'cv::ocl::Device::ptr()'],['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html#aad117cd27428a963bd1a5958910e064c',1,'cv::dnn::Dict::ptr(const String &key)'],['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html#acae8058cc74a14207d7d5b9dfa938a3f',1,'cv::dnn::Dict::ptr(const String &key) const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a8c9aedf97e18e6b354368f70cb83f876',1,'cv::FileNode::ptr()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae2d63376445a5365b0a5457c666d6f78',1,'cv::FileNode::ptr() const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#aa83fa0825c60eb22a11a87a98c3cd5ed',1,'cv::cuda::GpuMat::ptr(int y=0)'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ad95918b9342332a41a584b21134b0959',1,'cv::cuda::GpuMat::ptr(int y=0) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#af0389962003eec644007c7ca85a04f6d',1,'cv::cuda::GpuMat::ptr(int y=0)'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a2d7003ff9fa0a24c5e4986174c29820f',1,'cv::cuda::GpuMat::ptr(int y=0) const'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#a26c16086f0106c08df0152871aca1e6d',1,'cv::ocl::Image2D::ptr()'],['https://docs.opencv.org/4.2.0/da/d03/classcv_1_1gapi_1_1wip_1_1IStreamSource.html#ad3d4f3f6fb1f275bd04d574b5add03d4',1,'cv::gapi::wip::IStreamSource::ptr()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#aaa89be975dd21c23ee86ff1ad977d2e2',1,'cv::ocl::Kernel::ptr()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a13acd320291229615ef15f96ff1ff738',1,'cv::Mat::ptr(int i0=0)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af13f821918f452657f53bc3f750323cb',1,'cv::Mat::ptr(int i0=0) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af774caab4a38c6f7890f3254ad71eccf',1,'cv::Mat::ptr(int row, int col)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#abcfcc1798528b49495e1263eab31127d',1,'cv::Mat::ptr(int row, int col) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ad2bc0c6a23243540e16607868c17be92',1,'cv::Mat::ptr(int i0, int i1, int i2)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#abfb233ffa8b26a78c36e733f61da2a3e',1,'cv::Mat::ptr(int i0, int i1, int i2) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ab0e3de187bb27c384269b243e8789ba9',1,'cv::Mat::ptr(const int *idx)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a3ef72b9ebc9581796ed68382df8fb064',1,'cv::Mat::ptr(const int *idx) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a7ce1d8cc9a83ae7cab79766d0eb6c0a8',1,'cv::Mat::ptr(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a9ea1a1bfbbb2393a4e162230dccbe1f0',1,'cv::Mat::ptr(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a5a9ffc908ac90604f36a8b6a1038747d',1,'cv::Mat::ptr(int i0=0)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a6a6b3696440fe48751bfe60fe2a729f3',1,'cv::Mat::ptr(int i0=0) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a6f4278ede80e7a9fe55d8b03710e2343',1,'cv::Mat::ptr(int row, int col)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#abda2b96aa438a808b43425040a7da81a',1,'cv::Mat::ptr(int row, int col) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a2bf43f93c5cb610b657bd6e0e091c062',1,'cv::Mat::ptr(int i0, int i1, int i2)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a476f18d2b8d99748005150b24752512d',1,'cv::Mat::ptr(int i0, int i1, int i2) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a7cb2719706bcae72d26dbc9b2fdc02e6',1,'cv::Mat::ptr(const int *idx)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ac30da0a78cd38a72e8902f52660e2543',1,'cv::Mat::ptr(const int *idx) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a36ab9a1de78fd00a4f9acf3c8a5d4d05',1,'cv::Mat::ptr(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a15cac608c7a27fb961a81b9409aaa7e8',1,'cv::Mat::ptr(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#ac7a730baeea428e9b58c20805cc56248',1,'cv::gapi::own::Mat::ptr(int row, int col=0)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#acd4caa656fb17450db51a983d20383ab',1,'cv::gapi::own::Mat::ptr(int row, int col=0) const'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#aaf48a0b8cd1827f4ed6b551592119b04',1,'NCVMatrix::ptr()'],['https://docs.opencv.org/4.2.0/dc/d73/classNCVVector.html#a882fca1c27b65510357c7e2bb300d282',1,'NCVVector::ptr()'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#accc2d0c2117c3a455fb5a30d2f36aae6',1,'cv::ocl::Platform::ptr()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a6254d08954fc8ad190e0ce8256c85a01',1,'cv::ocl::Program::ptr()'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a8d201148fb55a19e748b20b2f50a0610',1,'cv::ocl::Queue::ptr()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a810b96cf23e3cc816e7f99473b81b513',1,'cv::SparseMat::ptr(int i0, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a14e7bb6106e6b4608ddbbc394bbf585e',1,'cv::SparseMat::ptr(int i0, int i1, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#afa0e9b6331a781f1d746e77582bee8a8',1,'cv::SparseMat::ptr(int i0, int i1, int i2, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a5425bac965f62767f50c7e68a7c452a0',1,'cv::SparseMat::ptr(const int *idx, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a810b96cf23e3cc816e7f99473b81b513',1,'cv::SparseMat::ptr(int i0, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a14e7bb6106e6b4608ddbbc394bbf585e',1,'cv::SparseMat::ptr(int i0, int i1, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#afa0e9b6331a781f1d746e77582bee8a8',1,'cv::SparseMat::ptr(int i0, int i1, int i2, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a5425bac965f62767f50c7e68a7c452a0',1,'cv::SparseMat::ptr(const int *idx, bool createMissing, size_t *hashval=0)']]], - ['ptr_718',['Ptr',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga6395ca871a678020c4a31fadf7e8cc63',1,'cv::Ptr'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga6395ca871a678020c4a31fadf7e8cc63',1,'Ptr(Global Namespace)']]], - ['ptr0_719',['ptr0',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#acc76bbdcf947d3040d9b6d0e0ca27714',1,'cv::LineIterator']]], - ['ptr_5ffun_720',['ptr_fun',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html#gaee61fcee12458d9d61b10f07de908134',1,'std::ptr_fun(_Result(*__x)(_Arg))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html#ga2c95cd7ca955ae3a4cbf98593456bd8e',1,'std::ptr_fun(_Result(*__x)(_Arg1, _Arg2))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html#gaee61fcee12458d9d61b10f07de908134',1,'ptr_fun(_Result(*__x)(_Arg))(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html#ga2c95cd7ca955ae3a4cbf98593456bd8e',1,'ptr_fun(_Result(*__x)(_Arg1, _Arg2))(Global Namespace)']]], - ['ptr_5fonly_721',['PTR_ONLY',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a1010adb068498c191b8079323ad790f9a11b9ffc35882068b09f14166ac3b52f5',1,'cv::ocl::KernelArg']]], - ['ptr_5fsz_5ftype_722',['ptr_sz_type',['https://docs.opencv.org/4.2.0/df/db4/structcv_1_1cudev_1_1PtrTraits_3_01Expr_3_01Body_01_4_01_4.html#a2142fd05d4bd4693e794548b00c27c37',1,'cv::cudev::PtrTraits< Expr< Body > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'cv::cudev::PtrTraitsBase::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< AffineMapPtrSz, AffineMapPtr >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op >, BinaryTransformPtr< Src1Ptr, Src2Ptr, Op > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< CommonAreaInterPtrSz< SrcPtr >, CommonAreaInterPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< ConstantPtrSz< T >, ConstantPtr< T > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< CubicInterPtrSz< SrcPtr >, CubicInterPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< DerivXPtrSz< SrcPtr >, DerivXPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< DerivYPtrSz< SrcPtr >, DerivYPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< GlobPtrSz< T >, GlobPtr< T > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< GpuMat_< T >, GlobPtr< T > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< IntegerAreaInterPtrSz< SrcPtr >, IntegerAreaInterPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< LaplacianPtrSz< ksize, SrcPtr >, LaplacianPtr< ksize, SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< LinearInterPtrSz< SrcPtr >, LinearInterPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< LutPtrSz< SrcPtr, TablePtr >, LutPtr< SrcPtr, TablePtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< NearestInterPtrSz< SrcPtr >, NearestInterPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< PerspectiveMapPtrSz, PerspectiveMapPtr >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< Ptr2DSz, Ptr2DSz >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< RemapPtr1Sz< SrcPtr, MapPtr >, RemapPtr1< SrcPtr, MapPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr >, RemapPtr2< SrcPtr, MapXPtr, MapYPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< ResizePtrSz< SrcPtr >, ResizePtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< ScharrXPtrSz< SrcPtr >, ScharrXPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< ScharrYPtrSz< SrcPtr >, ScharrYPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< SingleMaskChannelsSz< MaskPtr >, SingleMaskChannels< MaskPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< SobelXPtrSz< SrcPtr >, SobelXPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< SobelYPtrSz< SrcPtr >, SobelYPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< SrcPtr, SrcPtr >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< Texture< T >, TexturePtr< T > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< UnaryTransformPtrSz< SrcPtr, Op >, UnaryTransformPtr< SrcPtr, Op > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< ZipPtrSz< PtrTuple >, ZipPtr< PtrTuple > >::ptr_sz_type']]], - ['ptr_5ftraits_2eh_723',['ptr_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00449.html',1,'']]], - ['ptr_5ftype_724',['ptr_type',['https://docs.opencv.org/4.2.0/df/db4/structcv_1_1cudev_1_1PtrTraits_3_01Expr_3_01Body_01_4_01_4.html#a87f756f1d9b9d4bbfdbd595b872a4623',1,'cv::cudev::PtrTraits< Expr< Body > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'cv::cudev::PtrTraitsBase::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< AffineMapPtrSz, AffineMapPtr >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op >, BinaryTransformPtr< Src1Ptr, Src2Ptr, Op > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< CommonAreaInterPtrSz< SrcPtr >, CommonAreaInterPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< ConstantPtrSz< T >, ConstantPtr< T > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< CubicInterPtrSz< SrcPtr >, CubicInterPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< DerivXPtrSz< SrcPtr >, DerivXPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< DerivYPtrSz< SrcPtr >, DerivYPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< GlobPtrSz< T >, GlobPtr< T > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< GpuMat_< T >, GlobPtr< T > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< IntegerAreaInterPtrSz< SrcPtr >, IntegerAreaInterPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< LaplacianPtrSz< ksize, SrcPtr >, LaplacianPtr< ksize, SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< LinearInterPtrSz< SrcPtr >, LinearInterPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< LutPtrSz< SrcPtr, TablePtr >, LutPtr< SrcPtr, TablePtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< NearestInterPtrSz< SrcPtr >, NearestInterPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< PerspectiveMapPtrSz, PerspectiveMapPtr >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< Ptr2DSz, Ptr2DSz >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< RemapPtr1Sz< SrcPtr, MapPtr >, RemapPtr1< SrcPtr, MapPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr >, RemapPtr2< SrcPtr, MapXPtr, MapYPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< ResizePtrSz< SrcPtr >, ResizePtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< ScharrXPtrSz< SrcPtr >, ScharrXPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< ScharrYPtrSz< SrcPtr >, ScharrYPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< SingleMaskChannelsSz< MaskPtr >, SingleMaskChannels< MaskPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< SobelXPtrSz< SrcPtr >, SobelXPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< SobelYPtrSz< SrcPtr >, SobelYPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< SrcPtr, SrcPtr >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< Texture< T >, TexturePtr< T > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< UnaryTransformPtrSz< SrcPtr, Op >, UnaryTransformPtr< SrcPtr, Op > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< ZipPtrSz< PtrTuple >, ZipPtr< PtrTuple > >::ptr_type']]], - ['ptrreadonly_725',['PtrReadOnly',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a90411e7de61ef5cb3163634f0432a962',1,'cv::ocl::KernelArg']]], - ['ptrreadwrite_726',['PtrReadWrite',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a58399f09b9b3f98e6154707eb74e137f',1,'cv::ocl::KernelArg']]], - ['ptrs_727',['ptrs',['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#ab7c6aeaca3c95077786f894a549f48eb',1,'cv::NAryMatIterator']]], - ['ptrtraits_728',['PtrTraits',['https://docs.opencv.org/4.2.0/d2/d1a/structcv_1_1cudev_1_1PtrTraits.html',1,'cv::cudev']]], - ['ptrtraits_3c_20affinemapptrsz_20_3e_729',['PtrTraits< AffineMapPtrSz >',['https://docs.opencv.org/4.2.0/d5/d59/structcv_1_1cudev_1_1PtrTraits_3_01AffineMapPtrSz_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20binarytransformptrsz_3c_20src1ptr_2c_20src2ptr_2c_20op_20_3e_20_3e_730',['PtrTraits< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op > >',['https://docs.opencv.org/4.2.0/db/d13/structcv_1_1cudev_1_1PtrTraits_3_01BinaryTransformPtrSz_3_01Src1Ptr_00_01Src2Ptr_00_01Op_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20commonareainterptrsz_3c_20srcptr_20_3e_20_3e_731',['PtrTraits< CommonAreaInterPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d8/da8/structcv_1_1cudev_1_1PtrTraits_3_01CommonAreaInterPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20constantptrsz_3c_20t_20_3e_20_3e_732',['PtrTraits< ConstantPtrSz< T > >',['https://docs.opencv.org/4.2.0/d3/d15/structcv_1_1cudev_1_1PtrTraits_3_01ConstantPtrSz_3_01T_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20cubicinterptrsz_3c_20srcptr_20_3e_20_3e_733',['PtrTraits< CubicInterPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d1/d45/structcv_1_1cudev_1_1PtrTraits_3_01CubicInterPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20derivxptrsz_3c_20srcptr_20_3e_20_3e_734',['PtrTraits< DerivXPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d3/d89/structcv_1_1cudev_1_1PtrTraits_3_01DerivXPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20derivyptrsz_3c_20srcptr_20_3e_20_3e_735',['PtrTraits< DerivYPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d0/ddb/structcv_1_1cudev_1_1PtrTraits_3_01DerivYPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20expr_3c_20body_20_3e_20_3e_736',['PtrTraits< Expr< Body > >',['https://docs.opencv.org/4.2.0/df/db4/structcv_1_1cudev_1_1PtrTraits_3_01Expr_3_01Body_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20globptrsz_3c_20t_20_3e_20_3e_737',['PtrTraits< GlobPtrSz< T > >',['https://docs.opencv.org/4.2.0/dd/def/structcv_1_1cudev_1_1PtrTraits_3_01GlobPtrSz_3_01T_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20gpumat_5f_3c_20t_20_3e_20_3e_738',['PtrTraits< GpuMat_< T > >',['https://docs.opencv.org/4.2.0/de/d66/structcv_1_1cudev_1_1PtrTraits_3_01GpuMat___3_01T_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20integerareainterptrsz_3c_20srcptr_20_3e_20_3e_739',['PtrTraits< IntegerAreaInterPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d5/da1/structcv_1_1cudev_1_1PtrTraits_3_01IntegerAreaInterPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20laplacianptrsz_3c_20ksize_2c_20srcptr_20_3e_20_3e_740',['PtrTraits< LaplacianPtrSz< ksize, SrcPtr > >',['https://docs.opencv.org/4.2.0/dd/d0b/structcv_1_1cudev_1_1PtrTraits_3_01LaplacianPtrSz_3_01ksize_00_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20linearinterptrsz_3c_20srcptr_20_3e_20_3e_741',['PtrTraits< LinearInterPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d7/deb/structcv_1_1cudev_1_1PtrTraits_3_01LinearInterPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20lutptrsz_3c_20srcptr_2c_20tableptr_20_3e_20_3e_742',['PtrTraits< LutPtrSz< SrcPtr, TablePtr > >',['https://docs.opencv.org/4.2.0/d1/df8/structcv_1_1cudev_1_1PtrTraits_3_01LutPtrSz_3_01SrcPtr_00_01TablePtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20nearestinterptrsz_3c_20srcptr_20_3e_20_3e_743',['PtrTraits< NearestInterPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d7/da3/structcv_1_1cudev_1_1PtrTraits_3_01NearestInterPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20perspectivemapptrsz_20_3e_744',['PtrTraits< PerspectiveMapPtrSz >',['https://docs.opencv.org/4.2.0/db/dee/structcv_1_1cudev_1_1PtrTraits_3_01PerspectiveMapPtrSz_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20remapptr1sz_3c_20srcptr_2c_20mapptr_20_3e_20_3e_745',['PtrTraits< RemapPtr1Sz< SrcPtr, MapPtr > >',['https://docs.opencv.org/4.2.0/dd/d16/structcv_1_1cudev_1_1PtrTraits_3_01RemapPtr1Sz_3_01SrcPtr_00_01MapPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20remapptr2sz_3c_20srcptr_2c_20mapxptr_2c_20mapyptr_20_3e_20_3e_746',['PtrTraits< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr > >',['https://docs.opencv.org/4.2.0/d0/dc2/structcv_1_1cudev_1_1PtrTraits_3_01RemapPtr2Sz_3_01SrcPtr_00_01MapXPtr_00_01MapYPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20resizeptrsz_3c_20srcptr_20_3e_20_3e_747',['PtrTraits< ResizePtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/da/da2/structcv_1_1cudev_1_1PtrTraits_3_01ResizePtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20scharrxptrsz_3c_20srcptr_20_3e_20_3e_748',['PtrTraits< ScharrXPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d9/d3d/structcv_1_1cudev_1_1PtrTraits_3_01ScharrXPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20scharryptrsz_3c_20srcptr_20_3e_20_3e_749',['PtrTraits< ScharrYPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d6/d29/structcv_1_1cudev_1_1PtrTraits_3_01ScharrYPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20singlemaskchannelssz_3c_20maskptr_20_3e_20_3e_750',['PtrTraits< SingleMaskChannelsSz< MaskPtr > >',['https://docs.opencv.org/4.2.0/d4/d58/structcv_1_1cudev_1_1PtrTraits_3_01SingleMaskChannelsSz_3_01MaskPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20sobelxptrsz_3c_20srcptr_20_3e_20_3e_751',['PtrTraits< SobelXPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/dd/d73/structcv_1_1cudev_1_1PtrTraits_3_01SobelXPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20sobelyptrsz_3c_20srcptr_20_3e_20_3e_752',['PtrTraits< SobelYPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d4/d67/structcv_1_1cudev_1_1PtrTraits_3_01SobelYPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20srcptr_20_3e_753',['PtrTraits< SrcPtr >',['https://docs.opencv.org/4.2.0/d2/d1a/structcv_1_1cudev_1_1PtrTraits.html',1,'']]], - ['ptrtraits_3c_20texture_3c_20t_20_3e_20_3e_754',['PtrTraits< Texture< T > >',['https://docs.opencv.org/4.2.0/d2/db7/structcv_1_1cudev_1_1PtrTraits_3_01Texture_3_01T_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20unarytransformptrsz_3c_20srcptr_2c_20op_20_3e_20_3e_755',['PtrTraits< UnaryTransformPtrSz< SrcPtr, Op > >',['https://docs.opencv.org/4.2.0/df/d71/structcv_1_1cudev_1_1PtrTraits_3_01UnaryTransformPtrSz_3_01SrcPtr_00_01Op_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20zipptrsz_3c_20ptrtuple_20_3e_20_3e_756',['PtrTraits< ZipPtrSz< PtrTuple > >',['https://docs.opencv.org/4.2.0/db/d34/structcv_1_1cudev_1_1PtrTraits_3_01ZipPtrSz_3_01PtrTuple_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraitsbase_757',['PtrTraitsBase',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'cv::cudev']]], - ['ptrtraitsbase_3c_20affinemapptrsz_2c_20affinemapptr_20_3e_758',['PtrTraitsBase< AffineMapPtrSz, AffineMapPtr >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20binarytransformptrsz_3c_20src1ptr_2c_20src2ptr_2c_20op_20_3e_2c_20binarytransformptr_3c_20src1ptr_2c_20src2ptr_2c_20op_20_3e_20_3e_759',['PtrTraitsBase< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op >, BinaryTransformPtr< Src1Ptr, Src2Ptr, Op > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20commonareainterptrsz_3c_20srcptr_20_3e_2c_20commonareainterptr_3c_20srcptr_20_3e_20_3e_760',['PtrTraitsBase< CommonAreaInterPtrSz< SrcPtr >, CommonAreaInterPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20constantptrsz_3c_20t_20_3e_2c_20constantptr_3c_20t_20_3e_20_3e_761',['PtrTraitsBase< ConstantPtrSz< T >, ConstantPtr< T > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20cubicinterptrsz_3c_20srcptr_20_3e_2c_20cubicinterptr_3c_20srcptr_20_3e_20_3e_762',['PtrTraitsBase< CubicInterPtrSz< SrcPtr >, CubicInterPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20derivxptrsz_3c_20srcptr_20_3e_2c_20derivxptr_3c_20srcptr_20_3e_20_3e_763',['PtrTraitsBase< DerivXPtrSz< SrcPtr >, DerivXPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20derivyptrsz_3c_20srcptr_20_3e_2c_20derivyptr_3c_20srcptr_20_3e_20_3e_764',['PtrTraitsBase< DerivYPtrSz< SrcPtr >, DerivYPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20globptrsz_3c_20t_20_3e_2c_20globptr_3c_20t_20_3e_20_3e_765',['PtrTraitsBase< GlobPtrSz< T >, GlobPtr< T > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20gpumat_5f_3c_20t_20_3e_2c_20globptr_3c_20t_20_3e_20_3e_766',['PtrTraitsBase< GpuMat_< T >, GlobPtr< T > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20integerareainterptrsz_3c_20srcptr_20_3e_2c_20integerareainterptr_3c_20srcptr_20_3e_20_3e_767',['PtrTraitsBase< IntegerAreaInterPtrSz< SrcPtr >, IntegerAreaInterPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20laplacianptrsz_3c_20ksize_2c_20srcptr_20_3e_2c_20laplacianptr_3c_20ksize_2c_20srcptr_20_3e_20_3e_768',['PtrTraitsBase< LaplacianPtrSz< ksize, SrcPtr >, LaplacianPtr< ksize, SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20linearinterptrsz_3c_20srcptr_20_3e_2c_20linearinterptr_3c_20srcptr_20_3e_20_3e_769',['PtrTraitsBase< LinearInterPtrSz< SrcPtr >, LinearInterPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20lutptrsz_3c_20srcptr_2c_20tableptr_20_3e_2c_20lutptr_3c_20srcptr_2c_20tableptr_20_3e_20_3e_770',['PtrTraitsBase< LutPtrSz< SrcPtr, TablePtr >, LutPtr< SrcPtr, TablePtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20nearestinterptrsz_3c_20srcptr_20_3e_2c_20nearestinterptr_3c_20srcptr_20_3e_20_3e_771',['PtrTraitsBase< NearestInterPtrSz< SrcPtr >, NearestInterPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20perspectivemapptrsz_2c_20perspectivemapptr_20_3e_772',['PtrTraitsBase< PerspectiveMapPtrSz, PerspectiveMapPtr >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20ptr2dsz_2c_20ptr2dsz_20_3e_773',['PtrTraitsBase< Ptr2DSz, Ptr2DSz >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20remapptr1sz_3c_20srcptr_2c_20mapptr_20_3e_2c_20remapptr1_3c_20srcptr_2c_20mapptr_20_3e_20_3e_774',['PtrTraitsBase< RemapPtr1Sz< SrcPtr, MapPtr >, RemapPtr1< SrcPtr, MapPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20remapptr2sz_3c_20srcptr_2c_20mapxptr_2c_20mapyptr_20_3e_2c_20remapptr2_3c_20srcptr_2c_20mapxptr_2c_20mapyptr_20_3e_20_3e_775',['PtrTraitsBase< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr >, RemapPtr2< SrcPtr, MapXPtr, MapYPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20resizeptrsz_3c_20srcptr_20_3e_2c_20resizeptr_3c_20srcptr_20_3e_20_3e_776',['PtrTraitsBase< ResizePtrSz< SrcPtr >, ResizePtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20scharrxptrsz_3c_20srcptr_20_3e_2c_20scharrxptr_3c_20srcptr_20_3e_20_3e_777',['PtrTraitsBase< ScharrXPtrSz< SrcPtr >, ScharrXPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20scharryptrsz_3c_20srcptr_20_3e_2c_20scharryptr_3c_20srcptr_20_3e_20_3e_778',['PtrTraitsBase< ScharrYPtrSz< SrcPtr >, ScharrYPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20singlemaskchannelssz_3c_20maskptr_20_3e_2c_20singlemaskchannels_3c_20maskptr_20_3e_20_3e_779',['PtrTraitsBase< SingleMaskChannelsSz< MaskPtr >, SingleMaskChannels< MaskPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20sobelxptrsz_3c_20srcptr_20_3e_2c_20sobelxptr_3c_20srcptr_20_3e_20_3e_780',['PtrTraitsBase< SobelXPtrSz< SrcPtr >, SobelXPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20sobelyptrsz_3c_20srcptr_20_3e_2c_20sobelyptr_3c_20srcptr_20_3e_20_3e_781',['PtrTraitsBase< SobelYPtrSz< SrcPtr >, SobelYPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20srcptr_2c_20srcptr_20_3e_782',['PtrTraitsBase< SrcPtr, SrcPtr >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20texture_3c_20t_20_3e_2c_20textureptr_3c_20t_20_3e_20_3e_783',['PtrTraitsBase< Texture< T >, TexturePtr< T > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20unarytransformptrsz_3c_20srcptr_2c_20op_20_3e_2c_20unarytransformptr_3c_20srcptr_2c_20op_20_3e_20_3e_784',['PtrTraitsBase< UnaryTransformPtrSz< SrcPtr, Op >, UnaryTransformPtr< SrcPtr, Op > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrtraitsbase_3c_20zipptrsz_3c_20ptrtuple_20_3e_2c_20zipptr_3c_20ptrtuple_20_3e_20_3e_785',['PtrTraitsBase< ZipPtrSz< PtrTuple >, ZipPtr< PtrTuple > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], - ['ptrwriteonly_786',['PtrWriteOnly',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a54217697aa71270c29c064b7c8f462f7',1,'cv::ocl::KernelArg']]], - ['pubimbue_787',['pubimbue',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'__gnu_cxx::enc_filebuf::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'__gnu_cxx::stdio_filebuf::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'__gnu_cxx::stdio_sync_filebuf::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'basic_filebuf< char_type, traits_type >::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'basic_streambuf< _Elem, _Tr >::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'basic_streambuf< char, _Traits >::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'basic_streambuf< char, char_traits< char > >::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'std::basic_filebuf::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'std::basic_streambuf::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'std::basic_stringbuf::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'std::wbuffer_convert::pubimbue()']]], - ['pubseekoff_788',['pubseekoff',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'__gnu_cxx::enc_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'__gnu_cxx::enc_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'__gnu_cxx::stdio_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'__gnu_cxx::stdio_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'__gnu_cxx::stdio_sync_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'__gnu_cxx::stdio_sync_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_filebuf< char_type, traits_type >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_filebuf< char_type, traits_type >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_streambuf< _Elem, _Tr >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_streambuf< _Elem, _Tr >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_streambuf< char, _Traits >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_streambuf< char, _Traits >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_streambuf< char, char_traits< char > >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_streambuf< char, char_traits< char > >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::basic_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::basic_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::basic_streambuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::basic_streambuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::basic_stringbuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::basic_stringbuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::wbuffer_convert::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::wbuffer_convert::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)']]], - ['pubseekpos_789',['pubseekpos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'__gnu_cxx::enc_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'__gnu_cxx::enc_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'__gnu_cxx::stdio_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'__gnu_cxx::stdio_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'__gnu_cxx::stdio_sync_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'__gnu_cxx::stdio_sync_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_filebuf< char_type, traits_type >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_filebuf< char_type, traits_type >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_streambuf< _Elem, _Tr >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_streambuf< _Elem, _Tr >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_streambuf< char, _Traits >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_streambuf< char, _Traits >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_streambuf< char, char_traits< char > >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_streambuf< char, char_traits< char > >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::basic_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::basic_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::basic_streambuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::basic_streambuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::basic_stringbuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::basic_stringbuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::wbuffer_convert::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::wbuffer_convert::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)']]], - ['pubsetbuf_790',['pubsetbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'__gnu_cxx::enc_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'__gnu_cxx::enc_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'__gnu_cxx::stdio_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'__gnu_cxx::stdio_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'__gnu_cxx::stdio_sync_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'__gnu_cxx::stdio_sync_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_filebuf< char_type, traits_type >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_filebuf< char_type, traits_type >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_streambuf< _Elem, _Tr >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_streambuf< _Elem, _Tr >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_streambuf< char, _Traits >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_streambuf< char, _Traits >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_streambuf< char, char_traits< char > >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_streambuf< char, char_traits< char > >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::basic_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::basic_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::basic_streambuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::basic_streambuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::basic_stringbuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::basic_stringbuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::wbuffer_convert::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::wbuffer_convert::pubsetbuf(char_type *__s, streamsize __n)']]], - ['pubsync_791',['pubsync',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'__gnu_cxx::enc_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'__gnu_cxx::enc_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'__gnu_cxx::stdio_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'__gnu_cxx::stdio_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'__gnu_cxx::stdio_sync_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'__gnu_cxx::stdio_sync_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_filebuf< char_type, traits_type >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_filebuf< char_type, traits_type >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_streambuf< _Elem, _Tr >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_streambuf< _Elem, _Tr >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_streambuf< char, _Traits >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_streambuf< char, _Traits >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_streambuf< char, char_traits< char > >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_streambuf< char, char_traits< char > >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::basic_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::basic_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::basic_streambuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::basic_streambuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::basic_stringbuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::basic_stringbuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::wbuffer_convert::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::wbuffer_convert::pubsync()']]], - ['pull_792',['pull',['https://docs.opencv.org/4.2.0/dd/d1c/classcv_1_1gapi_1_1wip_1_1GCaptureSource.html#a51e5143c603dd8ca571ab6dd91215ec6',1,'cv::gapi::wip::GCaptureSource::pull()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#af4c31493fc72aae2afabcbe8eec9aaa5',1,'cv::GStreamingCompiled::pull()'],['https://docs.opencv.org/4.2.0/da/d03/classcv_1_1gapi_1_1wip_1_1IStreamSource.html#aabf1343183c118fa2a5818d519fce4cc',1,'cv::gapi::wip::IStreamSource::pull()']]], - ['pulldevicetelemetry_793',['pullDeviceTelemetry',['../namespacecan.html#a7e2b4dcc5578fd7dbc59f7ccc8f2f84c',1,'can']]], - ['pullmotorposition_794',['pullMotorPosition',['../namespacecan_1_1motor.html#a26b1ed31074df37917d234af08c2aa67',1,'can::motor']]], - ['pupils_795',['pupils',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a48d68964b78b552abf1be9232169092a',1,'cv::face::FacemarkLBF::Params']]], - ['purple_796',['purple',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a8ce3de6a0b8bb7119bfbde66f8d35b1d',1,'cv::viz::Color']]], - ['push_797',['push',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a7efe15f8159c166b68a24486ec561608',1,'stack< _StateSeqT >::push()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#acf5286a0e5aa7354459ca1553ba54688',1,'std::priority_queue::push()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#a18c27834d93d4d897d92f4fa6f910edf',1,'std::queue::push()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a7efe15f8159c166b68a24486ec561608',1,'std::stack::push()']]], - ['push_5fback_798',['push_back',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af4bd5c2cb936dd363816d867aab22a61',1,'cv::Mat::push_back(const _Tp &elem)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a1cfeb3a75570697426971403fc1ddb0d',1,'cv::Mat::push_back(const Mat_< _Tp > &elem)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a6fc040ee744749ba434fd5806ce2e3f2',1,'cv::Mat::push_back(const std::vector< _Tp > &elem)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a3676bae1741459eda3771e8653357c53',1,'cv::Mat::push_back(const Mat &m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae447c4a9eff875257d755a7f8f6d15f4',1,'__gnu_cxx::__versa_string::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< _CharT >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< _CharT, _Traits, _Allocator >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< char >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< char, char_traits< char >, _Byte_alloc >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< char_type, _Traits, _Alloc >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< value_type >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#aa261893d7576d53592700d030dedae78',1,'deque< _StateSeqT >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a164bc4a9a0f40d98579507cfa9bb0313',1,'list< __inp, __rebind_inp >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'match_results< _Bi_iter >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'std::basic_string::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#aa261893d7576d53592700d030dedae78',1,'std::deque::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a164bc4a9a0f40d98579507cfa9bb0313',1,'std::list::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'std::match_results::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a33d8f9d5743852a2ad4db802d0eaeee1',1,'std::tr2::dynamic_bitset::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'std::vector::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< __diff_type >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _CharClassT >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _CharT >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _Cmpt >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _Node *, _Nodeptr_Alloc >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _RealType >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _State< _TraitsT::char_type > >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _StringT >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< block_type, allocator_type >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< Catalog_info * >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< double >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< int >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< result_type >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< size_t >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< std::pair< _BiIter, int > >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< std::pair< _StateIdT, std::vector > >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< std::pair< _StrTransT, _StrTransT > >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< sub_match< _Bi_iter >, _Alloc >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< sub_match< _BiIter >, _Alloc >::push_back()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab9e0253c92736db021840105d374c4c4.html#ab9e0253c92736db021840105d374c4c4',1,'nlohmann::basic_json::push_back(basic_json &&val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3405d38087e13994a5a4556065b0be6d.html#a3405d38087e13994a5a4556065b0be6d',1,'nlohmann::basic_json::push_back(const basic_json &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad704839e6a5195e3b76f22e2b9aa63ee.html#ad704839e6a5195e3b76f22e2b9aa63ee',1,'nlohmann::basic_json::push_back(const typename object_t::value_type &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4567cf75f19b1efca090f75d7a8a350a.html#a4567cf75f19b1efca090f75d7a8a350a',1,'nlohmann::basic_json::push_back(initializer_list_t init)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a697d12b5bd6205f8866691b166b7c7dc.html#a697d12b5bd6205f8866691b166b7c7dc',1,'nlohmann::json_pointer::push_back(const std::string &token)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_ac228b13596d3c34185da9fe61b570194.html#ac228b13596d3c34185da9fe61b570194',1,'nlohmann::json_pointer::push_back(std::string &&token)']]], - ['push_5fback_5f_799',['push_back_',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a57c658e2a97dda24fef1be2e625da914',1,'cv::Mat']]], - ['push_5ffront_800',['push_front',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#a2ac4fcc26b5a8e8d3db9993ca3b6f777',1,'__gnu_parallel::_RestrictedBoundedConcurrentQueue::push_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#a2ac4fcc26b5a8e8d3db9993ca3b6f777',1,'_RestrictedBoundedConcurrentQueue< pair< _RAIter, _RAIter > >::push_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5e23e99b8919a725e105786dd2bf20e9',1,'deque< _StateSeqT >::push_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a43ce26ebd4c6a1789692b7d377f332f3',1,'list< __inp, __rebind_inp >::push_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5e23e99b8919a725e105786dd2bf20e9',1,'std::deque::push_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac2d708075d40071265f0a376591ba1d7',1,'std::forward_list::push_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a43ce26ebd4c6a1789692b7d377f332f3',1,'std::list::push_front()']]], - ['push_5fheap_801',['push_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gad2a3e8fb6069d9cd1b14c186ec125102',1,'std::push_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gac0d64c0744947b3d233779d9e9f656cc',1,'std::push_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gad2a3e8fb6069d9cd1b14c186ec125102',1,'push_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gac0d64c0744947b3d233779d9e9f656cc',1,'push_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['pushback_802',['pushBack',['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a81161c1f209a241259f22714334f0bd1',1,'cv::videostab::InpaintingPipeline::pushBack()'],['https://docs.opencv.org/4.2.0/d9/d76/classcv_1_1videostab_1_1MotionStabilizationPipeline.html#a60a77269a6d3af5749b160bb5c183e85',1,'cv::videostab::MotionStabilizationPipeline::pushBack()']]], - ['pushframeoffset_803',['pushFrameOffset',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#aab5e3560b55c6443f065ab8bf1659649',1,'cv::AVIWriteContainer']]], - ['pushframesize_804',['pushFrameSize',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#ad3cf2fc3a24023cfd7c6ba5e774e3db5',1,'cv::AVIWriteContainer']]], - ['puss_805',['puss',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#ac707e91cc2a16a5aea2cb999c53390a4',1,'cv::stereo::Matching']]], - ['put_806',['put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'basic_iostream< char >::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'basic_iostream< char >::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'basic_ostream< char >::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'basic_ostream< char >::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'basic_ostream< char, _Traits >::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'basic_ostream< char, _Traits >::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_fstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_fstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_iostream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_iostream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_ofstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_ofstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_ostream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_ostream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_ostringstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_ostringstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_stringstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_stringstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a5570c5a84860556788a8df682a983bab',1,'std::money_put::put(iter_type __s, bool __intl, ios_base &__io, char_type __fill, long double __units) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a63f3f803e249021f43aa8efc9abf9cca',1,'std::money_put::put(iter_type __s, bool __intl, ios_base &__io, char_type __fill, const string_type &__digits) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#aee69742de1a8e31ec291c3d9ed8b6779',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, bool __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ac2219285def97823139415bcacd89e42',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, const void *__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a979896c98edc3a6fa116c277148622fb',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a1f76c7a2ddb936ac6a46cafb7e482f91',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, unsigned long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a4e520179f48db1bcd852066ce86f2b7d',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ad5858234a5d78c697063ba8190452d61',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, unsigned long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ae18fddb4a48878fe0a58abe4d7b0aca7',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, double __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a3c956b3279105a66090bdc73dd340a4b',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, long double __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a979896c98edc3a6fa116c277148622fb',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a1f76c7a2ddb936ac6a46cafb7e482f91',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, unsigned long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a4e520179f48db1bcd852066ce86f2b7d',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ad5858234a5d78c697063ba8190452d61',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, unsigned long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ae18fddb4a48878fe0a58abe4d7b0aca7',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, double __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a3c956b3279105a66090bdc73dd340a4b',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, long double __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a8e6943d3a21fc654c245ac5ec60eb507',1,'std::time_put::put(iter_type __s, ios_base &__io, char_type __fill, const tm *__tm, const _CharT *__beg, const _CharT *__end) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a85643bdff3768dd8b9e0089e5c279561',1,'std::time_put::put(iter_type __s, ios_base &__io, char_type __fill, const tm *__tm, char __format, char __mod=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a8e6943d3a21fc654c245ac5ec60eb507',1,'std::time_put_byname::put(iter_type __s, ios_base &__io, char_type __fill, const tm *__tm, const _CharT *__beg, const _CharT *__end) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a85643bdff3768dd8b9e0089e5c279561',1,'std::time_put_byname::put(iter_type __s, ios_base &__io, char_type __fill, const tm *__tm, char __format, char __mod=0) const']]], - ['put_5fmoney_807',['put_money',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4223c5b3a51cbf3a2d8910fb8415bf73',1,'std']]], - ['put_5ftime_808',['put_time',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac209d7732c2ceff781a6aa0bb278db86',1,'std']]], - ['putback_809',['putback',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'basic_iostream< char >::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'basic_iostream< char >::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'basic_istream< char >::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'basic_istream< char >::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'basic_istream< char, _Traits >::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'basic_istream< char, _Traits >::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_fstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_fstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_ifstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_ifstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_iostream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_iostream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_istream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_istream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_istringstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_istringstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_stringstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_stringstream::putback(char_type __c)']]], - ['putstreambyte_810',['putStreamByte',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a13d1893209953609f93746fa5702b756',1,'cv::AVIWriteContainer']]], - ['putstreambytes_811',['putStreamBytes',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a3d1a50d1ef3dacef8ef9dc70a8b110c9',1,'cv::AVIWriteContainer']]], - ['puttext_812',['putText',['https://docs.opencv.org/4.2.0/d9/dfa/classcv_1_1freetype_1_1FreeType2.html#aba641f774c47a70eaeb76bf7aa865915',1,'cv::freetype::FreeType2::putText()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga5126f47f883d730f633d74f07456c576',1,'cv::putText()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga5126f47f883d730f633d74f07456c576',1,'putText()(Global Namespace)']]], - ['pv_813',['pv',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a6031804735741aeb061c6292ebafae05',1,'cv::dnn::DictValue']]], - ['pword_814',['pword',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'basic_ios< char, _Traits >::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'basic_iostream< char >::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'basic_istream< char >::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'basic_istream< char, _Traits >::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'basic_ostream< char >::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'basic_ostream< char, _Traits >::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_fstream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_ifstream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_ios::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_iostream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_istream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_istringstream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_ofstream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_ostream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_ostringstream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_stringstream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::ios_base::pword()']]], - ['px_815',['Px',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#a6d4656662b0860b16bed40411a529352',1,'cv::datasets::join']]], - ['py_816',['Py',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#a154c4f2f0edcc2dadfbbb90b379cc770',1,'cv::datasets::join']]], - ['py_5f2d_5fhistogram_2emarkdown_817',['py_2d_histogram.markdown',['https://docs.opencv.org/4.2.0/d1/d30/py__2d__histogram_8markdown.html',1,'']]], - ['py_5fbasic_5fops_2emarkdown_818',['py_basic_ops.markdown',['https://docs.opencv.org/4.2.0/d3/dc6/py__basic__ops_8markdown.html',1,'']]], - ['py_5fbg_5fsubtraction_2emarkdown_819',['py_bg_subtraction.markdown',['https://docs.opencv.org/4.2.0/df/dba/py__bg__subtraction_8markdown.html',1,'']]], - ['py_5fbindings_5fbasics_2emarkdown_820',['py_bindings_basics.markdown',['https://docs.opencv.org/4.2.0/d3/d5b/py__bindings__basics_8markdown.html',1,'']]], - ['py_5fbrief_2emarkdown_821',['py_brief.markdown',['https://docs.opencv.org/4.2.0/d1/d54/py__brief_8markdown.html',1,'']]], - ['py_5fcalibration_2emarkdown_822',['py_calibration.markdown',['https://docs.opencv.org/4.2.0/d7/da4/py__calibration_8markdown.html',1,'']]], - ['py_5fcanny_2emarkdown_823',['py_canny.markdown',['https://docs.opencv.org/4.2.0/d2/dbb/py__canny_8markdown.html',1,'']]], - ['py_5fcolorspaces_2emarkdown_824',['py_colorspaces.markdown',['https://docs.opencv.org/4.2.0/d6/d11/py__colorspaces_8markdown.html',1,'']]], - ['py_5fcontour_5ffeatures_2emarkdown_825',['py_contour_features.markdown',['https://docs.opencv.org/4.2.0/d9/d94/py__contour__features_8markdown.html',1,'']]], - ['py_5fcontour_5fproperties_2emarkdown_826',['py_contour_properties.markdown',['https://docs.opencv.org/4.2.0/d5/dc6/py__contour__properties_8markdown.html',1,'']]], - ['py_5fcontours_5fbegin_2emarkdown_827',['py_contours_begin.markdown',['https://docs.opencv.org/4.2.0/dc/d7c/py__contours__begin_8markdown.html',1,'']]], - ['py_5fcontours_5fhierarchy_2emarkdown_828',['py_contours_hierarchy.markdown',['https://docs.opencv.org/4.2.0/d0/d31/py__contours__hierarchy_8markdown.html',1,'']]], - ['py_5fcontours_5fmore_5ffunctions_2emarkdown_829',['py_contours_more_functions.markdown',['https://docs.opencv.org/4.2.0/db/db2/py__contours__more__functions_8markdown.html',1,'']]], - ['py_5fdepthmap_2emarkdown_830',['py_depthmap.markdown',['https://docs.opencv.org/4.2.0/d8/d81/py__depthmap_8markdown.html',1,'']]], - ['py_5fdrawing_5ffunctions_2emarkdown_831',['py_drawing_functions.markdown',['https://docs.opencv.org/4.2.0/d6/dd5/py__drawing__functions_8markdown.html',1,'']]], - ['py_5fepipolar_5fgeometry_2emarkdown_832',['py_epipolar_geometry.markdown',['https://docs.opencv.org/4.2.0/d9/dae/py__epipolar__geometry_8markdown.html',1,'']]], - ['py_5fface_5fdetection_2emarkdown_833',['py_face_detection.markdown',['https://docs.opencv.org/4.2.0/d6/d2a/py__face__detection_8markdown.html',1,'']]], - ['py_5ffast_2emarkdown_834',['py_fast.markdown',['https://docs.opencv.org/4.2.0/d8/dc1/py__fast_8markdown.html',1,'']]], - ['py_5ffeature_5fhomography_2emarkdown_835',['py_feature_homography.markdown',['https://docs.opencv.org/4.2.0/d4/dba/py__feature__homography_8markdown.html',1,'']]], - ['py_5ffeatures_5fharris_2emarkdown_836',['py_features_harris.markdown',['https://docs.opencv.org/4.2.0/d3/d20/py__features__harris_8markdown.html',1,'']]], - ['py_5ffeatures_5fmeaning_2emarkdown_837',['py_features_meaning.markdown',['https://docs.opencv.org/4.2.0/d5/d3f/py__features__meaning_8markdown.html',1,'']]], - ['py_5ffiltering_2emarkdown_838',['py_filtering.markdown',['https://docs.opencv.org/4.2.0/d2/d24/py__filtering_8markdown.html',1,'']]], - ['py_5ffourier_5ftransform_2emarkdown_839',['py_fourier_transform.markdown',['https://docs.opencv.org/4.2.0/d3/dc2/py__fourier__transform_8markdown.html',1,'']]], - ['py_5fgeometric_5ftransformations_2emarkdown_840',['py_geometric_transformations.markdown',['https://docs.opencv.org/4.2.0/de/d07/py__geometric__transformations_8markdown.html',1,'']]], - ['py_5fgrabcut_2emarkdown_841',['py_grabcut.markdown',['https://docs.opencv.org/4.2.0/d8/d4a/py__grabcut_8markdown.html',1,'']]], - ['py_5fgradients_2emarkdown_842',['py_gradients.markdown',['https://docs.opencv.org/4.2.0/de/d45/py__gradients_8markdown.html',1,'']]], - ['py_5fhdr_2emarkdown_843',['py_hdr.markdown',['https://docs.opencv.org/4.2.0/db/d99/py__hdr_8markdown.html',1,'']]], - ['py_5fhistogram_5fbackprojection_2emarkdown_844',['py_histogram_backprojection.markdown',['https://docs.opencv.org/4.2.0/da/dd1/py__histogram__backprojection_8markdown.html',1,'']]], - ['py_5fhistogram_5fbegins_2emarkdown_845',['py_histogram_begins.markdown',['https://docs.opencv.org/4.2.0/dc/dff/py__histogram__begins_8markdown.html',1,'']]], - ['py_5fhistogram_5fequalization_2emarkdown_846',['py_histogram_equalization.markdown',['https://docs.opencv.org/4.2.0/d9/da3/py__histogram__equalization_8markdown.html',1,'']]], - ['py_5fhoughcircles_2emarkdown_847',['py_houghcircles.markdown',['https://docs.opencv.org/4.2.0/d9/dae/py__houghcircles_8markdown.html',1,'']]], - ['py_5fhoughlines_2emarkdown_848',['py_houghlines.markdown',['https://docs.opencv.org/4.2.0/d9/da9/py__houghlines_8markdown.html',1,'']]], - ['py_5fimage_5farithmetics_2emarkdown_849',['py_image_arithmetics.markdown',['https://docs.opencv.org/4.2.0/d3/d59/py__image__arithmetics_8markdown.html',1,'']]], - ['py_5fimage_5fdisplay_2emarkdown_850',['py_image_display.markdown',['https://docs.opencv.org/4.2.0/d4/df1/py__image__display_8markdown.html',1,'']]], - ['py_5finpainting_2emarkdown_851',['py_inpainting.markdown',['https://docs.opencv.org/4.2.0/d8/d64/py__inpainting_8markdown.html',1,'']]], - ['py_5fintro_2emarkdown_852',['py_intro.markdown',['https://docs.opencv.org/4.2.0/dc/dd8/py__intro_8markdown.html',1,'']]], - ['py_5fkmeans_5findex_2emarkdown_853',['py_kmeans_index.markdown',['https://docs.opencv.org/4.2.0/d1/d7d/py__kmeans__index_8markdown.html',1,'']]], - ['py_5fkmeans_5fopencv_2emarkdown_854',['py_kmeans_opencv.markdown',['https://docs.opencv.org/4.2.0/da/dac/py__kmeans__opencv_8markdown.html',1,'']]], - ['py_5fkmeans_5funderstanding_2emarkdown_855',['py_kmeans_understanding.markdown',['https://docs.opencv.org/4.2.0/d0/d17/py__kmeans__understanding_8markdown.html',1,'']]], - ['py_5fknn_5findex_2emarkdown_856',['py_knn_index.markdown',['https://docs.opencv.org/4.2.0/d0/d0a/py__knn__index_8markdown.html',1,'']]], - ['py_5fknn_5fopencv_2emarkdown_857',['py_knn_opencv.markdown',['https://docs.opencv.org/4.2.0/de/d86/py__knn__opencv_8markdown.html',1,'']]], - ['py_5fknn_5funderstanding_2emarkdown_858',['py_knn_understanding.markdown',['https://docs.opencv.org/4.2.0/d1/dae/py__knn__understanding_8markdown.html',1,'']]], - ['py_5flucas_5fkanade_2emarkdown_859',['py_lucas_kanade.markdown',['https://docs.opencv.org/4.2.0/d3/d72/py__lucas__kanade_8markdown.html',1,'']]], - ['py_5fmatcher_2emarkdown_860',['py_matcher.markdown',['https://docs.opencv.org/4.2.0/d9/ded/py__matcher_8markdown.html',1,'']]], - ['py_5fmeanshift_2emarkdown_861',['py_meanshift.markdown',['https://docs.opencv.org/4.2.0/d4/d1f/py__meanshift_8markdown.html',1,'']]], - ['py_5fmorphological_5fops_2emarkdown_862',['py_morphological_ops.markdown',['https://docs.opencv.org/4.2.0/d3/df1/py__morphological__ops_8markdown.html',1,'']]], - ['py_5fmouse_5fhandling_2emarkdown_863',['py_mouse_handling.markdown',['https://docs.opencv.org/4.2.0/dc/d46/py__mouse__handling_8markdown.html',1,'']]], - ['py_5fnon_5flocal_5fmeans_2emarkdown_864',['py_non_local_means.markdown',['https://docs.opencv.org/4.2.0/d5/d0e/py__non__local__means_8markdown.html',1,'']]], - ['py_5foptimization_2emarkdown_865',['py_optimization.markdown',['https://docs.opencv.org/4.2.0/d8/d10/py__optimization_8markdown.html',1,'']]], - ['py_5forb_2emarkdown_866',['py_orb.markdown',['https://docs.opencv.org/4.2.0/d1/d67/py__orb_8markdown.html',1,'']]], - ['py_5fpose_2emarkdown_867',['py_pose.markdown',['https://docs.opencv.org/4.2.0/d4/d76/py__pose_8markdown.html',1,'']]], - ['py_5fpyramids_2emarkdown_868',['py_pyramids.markdown',['https://docs.opencv.org/4.2.0/d9/dd9/py__pyramids_8markdown.html',1,'']]], - ['py_5fsetup_5fin_5ffedora_2emarkdown_869',['py_setup_in_fedora.markdown',['https://docs.opencv.org/4.2.0/df/dfe/py__setup__in__fedora_8markdown.html',1,'']]], - ['py_5fsetup_5fin_5fubuntu_2emarkdown_870',['py_setup_in_ubuntu.markdown',['https://docs.opencv.org/4.2.0/d7/de5/py__setup__in__ubuntu_8markdown.html',1,'']]], - ['py_5fsetup_5fin_5fwindows_2emarkdown_871',['py_setup_in_windows.markdown',['https://docs.opencv.org/4.2.0/d9/d98/py__setup__in__windows_8markdown.html',1,'']]], - ['py_5fshi_5ftomasi_2emarkdown_872',['py_shi_tomasi.markdown',['https://docs.opencv.org/4.2.0/d3/d35/py__shi__tomasi_8markdown.html',1,'']]], - ['py_5fsift_5fintro_2emarkdown_873',['py_sift_intro.markdown',['https://docs.opencv.org/4.2.0/df/d0a/py__sift__intro_8markdown.html',1,'']]], - ['py_5fsurf_5fintro_2emarkdown_874',['py_surf_intro.markdown',['https://docs.opencv.org/4.2.0/d3/d20/py__surf__intro_8markdown.html',1,'']]], - ['py_5fsvm_5fbasics_2emarkdown_875',['py_svm_basics.markdown',['https://docs.opencv.org/4.2.0/db/d07/py__svm__basics_8markdown.html',1,'']]], - ['py_5fsvm_5findex_2emarkdown_876',['py_svm_index.markdown',['https://docs.opencv.org/4.2.0/db/dcf/py__svm__index_8markdown.html',1,'']]], - ['py_5fsvm_5fopencv_2emarkdown_877',['py_svm_opencv.markdown',['https://docs.opencv.org/4.2.0/d2/dee/py__svm__opencv_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5fbindings_2emarkdown_878',['py_table_of_contents_bindings.markdown',['https://docs.opencv.org/4.2.0/d8/d93/py__table__of__contents__bindings_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5fcalib3d_2emarkdown_879',['py_table_of_contents_calib3d.markdown',['https://docs.opencv.org/4.2.0/d3/d9b/py__table__of__contents__calib3d_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5fcontours_2emarkdown_880',['py_table_of_contents_contours.markdown',['https://docs.opencv.org/4.2.0/dd/d39/py__table__of__contents__contours_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5fcore_2emarkdown_881',['py_table_of_contents_core.markdown',['https://docs.opencv.org/4.2.0/d2/da4/py__table__of__contents__core_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5ffeature2d_2emarkdown_882',['py_table_of_contents_feature2d.markdown',['https://docs.opencv.org/4.2.0/df/d42/py__table__of__contents__feature2d_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5fgui_2emarkdown_883',['py_table_of_contents_gui.markdown',['https://docs.opencv.org/4.2.0/d5/d05/py__table__of__contents__gui_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5fhistograms_2emarkdown_884',['py_table_of_contents_histograms.markdown',['https://docs.opencv.org/4.2.0/dc/d9e/py__table__of__contents__histograms_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5fimgproc_2emarkdown_885',['py_table_of_contents_imgproc.markdown',['https://docs.opencv.org/4.2.0/dd/df3/py__table__of__contents__imgproc_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5fml_2emarkdown_886',['py_table_of_contents_ml.markdown',['https://docs.opencv.org/4.2.0/d8/d9e/py__table__of__contents__ml_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5fobjdetect_2emarkdown_887',['py_table_of_contents_objdetect.markdown',['https://docs.opencv.org/4.2.0/df/d81/py__table__of__contents__objdetect_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5fphoto_2emarkdown_888',['py_table_of_contents_photo.markdown',['https://docs.opencv.org/4.2.0/d2/dca/py__table__of__contents__photo_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5fsetup_2emarkdown_889',['py_table_of_contents_setup.markdown',['https://docs.opencv.org/4.2.0/d9/d2c/py__table__of__contents__setup_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5ftransforms_2emarkdown_890',['py_table_of_contents_transforms.markdown',['https://docs.opencv.org/4.2.0/d2/d28/py__table__of__contents__transforms_8markdown.html',1,'']]], - ['py_5ftable_5fof_5fcontents_5fvideo_2emarkdown_891',['py_table_of_contents_video.markdown',['https://docs.opencv.org/4.2.0/d0/dd8/py__table__of__contents__video_8markdown.html',1,'']]], - ['py_5ftemplate_5fmatching_2emarkdown_892',['py_template_matching.markdown',['https://docs.opencv.org/4.2.0/d2/d82/py__template__matching_8markdown.html',1,'']]], - ['py_5fthresholding_2emarkdown_893',['py_thresholding.markdown',['https://docs.opencv.org/4.2.0/d2/d6d/py__thresholding_8markdown.html',1,'']]], - ['py_5ftrackbar_2emarkdown_894',['py_trackbar.markdown',['https://docs.opencv.org/4.2.0/d5/d3c/py__trackbar_8markdown.html',1,'']]], - ['py_5ftutorials_2emarkdown_895',['py_tutorials.markdown',['https://docs.opencv.org/4.2.0/d0/d23/py__tutorials_8markdown.html',1,'']]], - ['py_5fvideo_5fdisplay_2emarkdown_896',['py_video_display.markdown',['https://docs.opencv.org/4.2.0/dd/dd2/py__video__display_8markdown.html',1,'']]], - ['py_5fwatershed_2emarkdown_897',['py_watershed.markdown',['https://docs.opencv.org/4.2.0/da/d77/py__watershed_8markdown.html',1,'']]], - ['pyramid_5fdi_5fdx_898',['pyramid_dI_dx',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#adf097ce53bf09bd35ddb9df49dc3ba4f',1,'cv::rgbd::OdometryFrame']]], - ['pyramid_5fdi_5fdy_899',['pyramid_dI_dy',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a3202c5410bb4585f213aa6a8af047a9a',1,'cv::rgbd::OdometryFrame']]], - ['pyramid_5flevel_900',['pyramid_level',['https://docs.opencv.org/4.2.0/d2/dc7/structcv_1_1linemod_1_1Template.html#a9cddfbb854bbda7dd6d9df071fc6ca1e',1,'cv::linemod::Template']]], - ['pyramid_5flevels_901',['pyramid_levels',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#ab96bceee186a7c3caa7ac8eaacfba518',1,'cv::linemod::Detector']]], - ['pyramidcloud_902',['pyramidCloud',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a1fd66704ad6fd5d55b60dacae19eb885',1,'cv::rgbd::OdometryFrame']]], - ['pyramiddepth_903',['pyramidDepth',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#ab5c1d7604a30c6423a554d197ad6328f',1,'cv::rgbd::OdometryFrame']]], - ['pyramidimage_904',['pyramidImage',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#ad1299a265c8f7a932952ac71e05a5371',1,'cv::rgbd::OdometryFrame']]], - ['pyramidlevels_905',['pyramidLevels',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a89910918a6ca854364f0b563489b14cf',1,'cv::dynafu::Params::pyramidLevels'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a868a013f0c11c7d21710544eee57426e',1,'cv::kinfu::Params::pyramidLevels'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a3a9c96fdcc0c85c5a6587576809fb135',1,'cv::linemod::Detector::pyramidLevels()']]], - ['pyramidmask_906',['pyramidMask',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a93176e62511173bd9445acfb6848dba8',1,'cv::rgbd::OdometryFrame']]], - ['pyramidnormals_907',['pyramidNormals',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a2d90e9abf37775395d4f409fab2fb217',1,'cv::rgbd::OdometryFrame']]], - ['pyramidnormalsmask_908',['pyramidNormalsMask',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a85297b72d853ee9d6a27ad89dd11ad20',1,'cv::rgbd::OdometryFrame']]], - ['pyramids_909',['Pyramids',['https://docs.opencv.org/4.2.0/d4/d1f/tutorial_pyramids.html',1,'Image Pyramids'],['https://docs.opencv.org/4.2.0/dc/dff/tutorial_py_pyramids.html',1,'Image Pyramids'],['https://docs.opencv.org/4.2.0/d5/d0f/tutorial_js_pyramids.html',1,'Image Pyramids']]], - ['pyramids_2ehpp_910',['pyramids.hpp',['https://docs.opencv.org/4.2.0/d9/d3e/pyramids_8hpp.html',1,'']]], - ['pyramids_2emarkdown_911',['pyramids.markdown',['https://docs.opencv.org/4.2.0/da/d2a/pyramids_8markdown.html',1,'']]], - ['pyramidtexturedmask_912',['pyramidTexturedMask',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#aa78145af61d994f460e8ce13e68f01c7',1,'cv::rgbd::OdometryFrame']]], - ['pyrdown_913',['pyrDown',['https://docs.opencv.org/4.2.0/d7/d6f/classcv_1_1linemod_1_1QuantizedPyramid.html#a1c201c04dd31e2eee60e58f2676459d3',1,'cv::linemod::QuantizedPyramid::pyrDown()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaf9bba239dfca11654cb7f50f889fc2ff',1,'cv::pyrDown()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga9c8456de9792d96431e065f407c7a91b',1,'cv::cuda::pyrDown()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaf9bba239dfca11654cb7f50f889fc2ff',1,'pyrDown(InputArray src, OutputArray dst, const Size &dstsize=Size(), int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga9c8456de9792d96431e065f407c7a91b',1,'pyrDown(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['pyrdown_5f_914',['pyrDown_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9be12498be0657c4b8cd993626c8a23d',1,'cv::cudev::pyrDown_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9be12498be0657c4b8cd993626c8a23d',1,'pyrDown_()(Global Namespace)']]], - ['pyrdownbody_915',['PyrDownBody',['https://docs.opencv.org/4.2.0/d1/d8a/structcv_1_1cudev_1_1PyrDownBody.html',1,'cv::cudev']]], - ['pyrlkoptflowestimatorbase_916',['PyrLkOptFlowEstimatorBase',['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html',1,'cv::videostab::PyrLkOptFlowEstimatorBase'],['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html#ae6222bef78aae91f7580df19ed7217b5',1,'cv::videostab::PyrLkOptFlowEstimatorBase::PyrLkOptFlowEstimatorBase()']]], - ['pyrlkopticalflow_917',['PyrLKOpticalFlow',['https://docs.opencv.org/4.2.0/de/d2b/classcv_1_1superres_1_1PyrLKOpticalFlow.html',1,'cv::superres']]], - ['pyrmeanshiftfiltering_918',['pyrMeanShiftFiltering',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga9fabdce9543bd602445f5db3827e4cc0',1,'cv::pyrMeanShiftFiltering()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga9fabdce9543bd602445f5db3827e4cc0',1,'pyrMeanShiftFiltering()(Global Namespace)']]], - ['pyrotationwarper_919',['PyRotationWarper',['https://docs.opencv.org/4.2.0/d5/d76/classcv_1_1PyRotationWarper.html',1,'cv::PyRotationWarper'],['https://docs.opencv.org/4.2.0/d5/d76/classcv_1_1PyRotationWarper.html#addb2012225fc1060df95ce9900e77529',1,'cv::PyRotationWarper::PyRotationWarper(String type, float scale)'],['https://docs.opencv.org/4.2.0/d5/d76/classcv_1_1PyRotationWarper.html#a965c0546abb140199df38238e72e23f5',1,'cv::PyRotationWarper::PyRotationWarper()']]], - ['pyrup_920',['pyrUp',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gada75b59bdaaca411ed6fee10085eb784',1,'cv::pyrUp()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga2048da0dfdb9e4a726232c5cef7e5747',1,'cv::cuda::pyrUp()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gada75b59bdaaca411ed6fee10085eb784',1,'pyrUp(InputArray src, OutputArray dst, const Size &dstsize=Size(), int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga2048da0dfdb9e4a726232c5cef7e5747',1,'pyrUp(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['pyrup_5f_921',['pyrUp_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e0229bfc11693beb833a9fa824014b1',1,'cv::cudev::pyrUp_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e0229bfc11693beb833a9fa824014b1',1,'pyrUp_()(Global Namespace)']]], - ['pyrupbody_922',['PyrUpBody',['https://docs.opencv.org/4.2.0/d1/de8/structcv_1_1cudev_1_1PyrUpBody.html',1,'cv::cudev']]], - ['python_20bindings_923',['OpenCV-Python Bindings',['https://docs.opencv.org/4.2.0/df/da2/tutorial_py_table_of_contents_bindings.html',1,'']]], - ['python_20bindings_20works_924',['How OpenCV-Python Bindings Works?',['https://docs.opencv.org/4.2.0/da/d49/tutorial_py_bindings_basics.html',1,'']]], - ['python_20in_20fedora_925',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], - ['python_20in_20ubuntu_926',['Install OpenCV-Python in Ubuntu',['https://docs.opencv.org/4.2.0/d2/de6/tutorial_py_setup_in_ubuntu.html',1,'']]], - ['python_20in_20windows_927',['Install OpenCV-Python in Windows',['https://docs.opencv.org/4.2.0/d5/de5/tutorial_py_setup_in_windows.html',1,'']]], - ['python_20tutorials_928',['Python Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'Introduction to OpenCV-Python Tutorials'],['https://docs.opencv.org/4.2.0/d6/d00/tutorial_py_root.html',1,'OpenCV-Python Tutorials']]] + ['param_5ftype_83',['param_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06431.html',1,'std::bernoulli_distribution::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06439.html',1,'std::binomial_distribution< _IntType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06407.html',1,'std::cauchy_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06399.html',1,'std::chi_squared_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06495.html',1,'std::discrete_distribution< _IntType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06471.html',1,'std::exponential_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06487.html',1,'std::extreme_value_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06415.html',1,'std::fisher_f_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06391.html',1,'std::gamma_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06447.html',1,'std::geometric_distribution< _IntType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06383.html',1,'std::lognormal_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06455.html',1,'std::negative_binomial_distribution< _IntType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06375.html',1,'std::normal_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06503.html',1,'std::piecewise_constant_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06511.html',1,'std::piecewise_linear_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06463.html',1,'std::poisson_distribution< _IntType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06423.html',1,'std::student_t_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07987.html',1,'std::uniform_int_distribution< _IntType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06367.html',1,'std::uniform_real_distribution< _RealType >::param_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06479.html',1,'std::weibull_distribution< _RealType >::param_type']]], + ['paramdesc_84',['ParamDesc',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html',1,'cv::gapi::ie::detail']]], + ['parameter_20file_85',['Exporting a template parameter file',['https://docs.opencv.org/4.2.0/df/dc0/tutorial_qds_export_parameters.html',1,'']]], + ['parameter_5ftype_86',['parameter_type',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a348b7e31dc03183136269b9be4aaacf9',1,'cv::cudev::TypeTraits']]], + ['parameters_87',['Parameters',['../cameraconfig.html#intrinsic',1,'Intrinsic Parameters'],['https://docs.opencv.org/4.2.0/d4/d80/structcv_1_1DetectionBasedTracker_1_1Parameters.html',1,'cv::DetectionBasedTracker::Parameters'],['https://docs.opencv.org/4.2.0/d4/d80/structcv_1_1DetectionBasedTracker_1_1Parameters.html#a53c869cca43fe05698fa7b64d3e969a0',1,'cv::DetectionBasedTracker::Parameters::Parameters()'],['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'Writing Functions Taking Eigen Types as Parameters']]], + ['parameters_88',['parameters',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#af2c3de5745a8eb4312db652276d387e3',1,'cv::DetectionBasedTracker']]], + ['parametrizedline_89',['ParametrizedLine',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html',1,'Eigen::ParametrizedLine< class, _AmbientDim, _Options >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a43e71a77728409e15220495dc9724f04',1,'Eigen::ParametrizedLine::ParametrizedLine()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a3f26a2ac6fe39d39ba72e148f0f877ad',1,'Eigen::ParametrizedLine::ParametrizedLine(const Hyperplane< _Scalar, _AmbientDim, OtherOptions > &hyperplane)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#abf4318b4e0c2469e83ab049c9c177b80',1,'Eigen::ParametrizedLine::ParametrizedLine(const ParametrizedLine< OtherScalarType, AmbientDimAtCompileTime, OtherOptions > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a9ae3a16ee1d2a6cf09f45007451fa148',1,'Eigen::ParametrizedLine::ParametrizedLine(const VectorType &origin, const VectorType &direction)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a5261e771f71d975eaa9ebf8bc598129b',1,'Eigen::ParametrizedLine::ParametrizedLine(Index _dim)']]], + ['paramgrid_90',['ParamGrid',['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html',1,'cv::ml::ParamGrid'],['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a41f16ee1570e78af0d7362231138cc6c',1,'cv::ml::ParamGrid::ParamGrid()'],['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a4b8034d10d8dd7f083967176dc71d09b',1,'cv::ml::ParamGrid::ParamGrid(double _minVal, double _maxVal, double _logStep)']]], + ['params_91',['Params',['https://docs.opencv.org/4.2.0/d6/dad/structcv_1_1ClfMilBoost_1_1Params.html',1,'cv::ClfMilBoost::Params'],['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html',1,'cv::dynafu::Params'],['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html',1,'cv::face::FacemarkAAM::Params'],['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html',1,'cv::face::FacemarkKazemi::Params'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html',1,'cv::face::FacemarkLBF::Params'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html',1,'cv::gapi::ie::Params< class >'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html',1,'cv::kinfu::Params'],['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html',1,'cv::line_descriptor::BinaryDescriptor::Params'],['https://docs.opencv.org/4.2.0/d6/d86/structcv_1_1phase__unwrapping_1_1HistogramPhaseUnwrapping_1_1Params.html',1,'cv::phase_unwrapping::HistogramPhaseUnwrapping::Params'],['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html',1,'cv::SimpleBlobDetector::Params'],['https://docs.opencv.org/4.2.0/d3/d4d/structcv_1_1structured__light_1_1GrayCodePattern_1_1Params.html',1,'cv::structured_light::GrayCodePattern::Params'],['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html',1,'cv::structured_light::SinusoidalPattern::Params'],['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html',1,'cv::TrackerBoosting::Params'],['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html',1,'cv::TrackerCSRT::Params'],['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html',1,'cv::TrackerFeatureHAAR::Params'],['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1TrackerGOTURN_1_1Params.html',1,'cv::TrackerGOTURN::Params'],['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html',1,'cv::TrackerKCF::Params'],['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html',1,'cv::TrackerMedianFlow::Params'],['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html',1,'cv::TrackerMIL::Params'],['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html',1,'cv::TrackerSamplerCS::Params'],['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html',1,'cv::TrackerSamplerCSC::Params'],['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html',1,'cv::TrackerSamplerPF::Params'],['https://docs.opencv.org/4.2.0/d3/dd0/structcv_1_1TrackerTLD_1_1Params.html',1,'cv::TrackerTLD::Params'],['https://docs.opencv.org/4.2.0/d6/dad/structcv_1_1ClfMilBoost_1_1Params.html#a26197941a32d517c283cdc70f37bd76d',1,'cv::ClfMilBoost::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a4f7223785437a747780c7aed2df56d2e',1,'cv::TrackerSamplerCSC::Params::Params()'],['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html#a694d900b5d61c8690d4eae9dd6b0e9dd',1,'cv::TrackerSamplerCS::Params::Params()'],['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html#ad3f4f9d15af6556af91a45162366c6d3',1,'cv::TrackerSamplerPF::Params::Params()'],['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html#afe18591df265dadb5c708db996efa863',1,'cv::TrackerFeatureHAAR::Params::Params()'],['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html#a652b1b2c3e203bbca771883fdc09d551',1,'cv::TrackerMIL::Params::Params()'],['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#a7da79b1b870c2531cb9f9443593afe2b',1,'cv::TrackerBoosting::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/dd0/structcv_1_1TrackerTLD_1_1Params.html#a75686a52571df4ab2103524426d19006',1,'cv::TrackerTLD::Params::Params()'],['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a4ec755b778a69abf371b7b1f4ef9adda',1,'cv::TrackerKCF::Params::Params()'],['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1TrackerGOTURN_1_1Params.html#a509595d2caf0e2834c59bb380e6081e3',1,'cv::TrackerGOTURN::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a2b46465864ef259b3f76e0f43ed6d872',1,'cv::TrackerCSRT::Params::Params()'],['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#a3482c25c0512983c3a26c7cd612e5557',1,'cv::TrackerMedianFlow::Params::Params()'],['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a02c43ee3252633ac4106c00a680fa747',1,'cv::face::FacemarkKazemi::Params::Params()'],['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#a0262d5324ee1d9e7333d776aa944bc86',1,'cv::face::FacemarkAAM::Params::Params()'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a60df8fda3e1925ba584122a1ea64803e',1,'cv::face::FacemarkLBF::Params::Params()'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#abe0385ab38d7f17f4255fab7047e4440',1,'cv::gapi::ie::Params::Params()'],['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#aeabdb46e1e7238a3d081eb0c6b36169b',1,'cv::SimpleBlobDetector::Params::Params()'],['https://docs.opencv.org/4.2.0/d6/d86/structcv_1_1phase__unwrapping_1_1HistogramPhaseUnwrapping_1_1Params.html#ae694509893f66be9e2c62e00b6374339',1,'cv::phase_unwrapping::HistogramPhaseUnwrapping::Params::Params()'],['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#a4cd7ec719c6c86c13faa82115c43f217',1,'cv::line_descriptor::BinaryDescriptor::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/d4d/structcv_1_1structured__light_1_1GrayCodePattern_1_1Params.html#a6b32437033328592a235f76f7ed119af',1,'cv::structured_light::GrayCodePattern::Params::Params()'],['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#ab214b6cd84af5b3e5b759e5f6f731edd',1,'cv::structured_light::SinusoidalPattern::Params::Params()']]], + ['params_92',['params',['https://docs.opencv.org/4.2.0/da/dcd/structcv_1_1gapi_1_1GNetParam.html#aa66fcf43899f80cbddde27cee936390c',1,'cv::gapi::GNetParam::params'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a84e511f810b67411fddd2e5fbd8be6be',1,'cv::tbm::ITrackerByMatching::params()'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#a45f7b71e9007db6f13cb1535ce9b1a37',1,'cv::gapi::ie::Params::params()']]], + ['params_2eh_93',['params.h',['https://docs.opencv.org/4.2.0/da/d33/params_8h.html',1,'']]], + ['paramtype_94',['ParamType',['https://docs.opencv.org/4.2.0/dd/d77/structcv_1_1ParamType.html',1,'cv']]], + ['paramtype_3c_20_5ftp_2c_20typename_20std_3a_3aenable_5fif_3c_20std_3a_3ais_5fenum_3c_20_5ftp_20_3e_3a_3avalue_20_3e_3a_3atype_20_3e_95',['ParamType< _Tp, typename std::enable_if< std::is_enum< _Tp >::value >::type >',['https://docs.opencv.org/4.2.0/db/d0d/structcv_1_1ParamType_3_01__Tp_00_01typename_01std_1_1enable__if_3_01std_1_1is__enum_3_01__Tp_01_4_1_1value_01_4_1_1type_01_4.html',1,'cv']]], + ['paramtype_3c_20algorithm_20_3e_96',['ParamType< Algorithm >',['https://docs.opencv.org/4.2.0/d2/d39/structcv_1_1ParamType_3_01Algorithm_01_4.html',1,'cv']]], + ['paramtype_3c_20bool_20_3e_97',['ParamType< bool >',['https://docs.opencv.org/4.2.0/d1/d87/structcv_1_1ParamType_3_01bool_01_4.html',1,'cv']]], + ['paramtype_3c_20double_20_3e_98',['ParamType< double >',['https://docs.opencv.org/4.2.0/d4/d98/structcv_1_1ParamType_3_01double_01_4.html',1,'cv']]], + ['paramtype_3c_20float_20_3e_99',['ParamType< float >',['https://docs.opencv.org/4.2.0/dd/df2/structcv_1_1ParamType_3_01float_01_4.html',1,'cv']]], + ['paramtype_3c_20mat_20_3e_100',['ParamType< Mat >',['https://docs.opencv.org/4.2.0/db/d5f/structcv_1_1ParamType_3_01Mat_01_4.html',1,'cv']]], + ['paramtype_3c_20scalar_20_3e_101',['ParamType< Scalar >',['https://docs.opencv.org/4.2.0/d2/dda/structcv_1_1ParamType_3_01Scalar_01_4.html',1,'cv']]], + ['paramtype_3c_20std_3a_3avector_3c_20mat_20_3e_20_3e_102',['ParamType< std::vector< Mat > >',['https://docs.opencv.org/4.2.0/dc/d1c/structcv_1_1ParamType_3_01std_1_1vector_3_01Mat_01_4_01_4.html',1,'cv']]], + ['paramtype_3c_20string_20_3e_103',['ParamType< String >',['https://docs.opencv.org/4.2.0/d0/d5f/structcv_1_1ParamType_3_01String_01_4.html',1,'cv']]], + ['paramtype_3c_20uchar_20_3e_104',['ParamType< uchar >',['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1ParamType_3_01uchar_01_4.html',1,'cv']]], + ['paramtype_3c_20uint64_20_3e_105',['ParamType< uint64 >',['https://docs.opencv.org/4.2.0/dc/d63/structcv_1_1ParamType_3_01uint64_01_4.html',1,'cv']]], + ['paramtype_3c_20unsigned_20_3e_106',['ParamType< unsigned >',['https://docs.opencv.org/4.2.0/d7/d68/structcv_1_1ParamType_3_01unsigned_01_4.html',1,'cv']]], + ['paramtypes_107',['ParamTypes',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3',1,'cv::ml::SVM']]], + ['parasolcells_5fbeta_108',['parasolCells_beta',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a1705f791f4a5d5b6745fb31e61763e1b',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters']]], + ['parasolcells_5fk_109',['parasolCells_k',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a24aec5077fabb9a09f8ab1c97f64a265',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters']]], + ['parasolcells_5ftau_110',['parasolCells_tau',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a164ab19d1ffe43c1a3ef9c230065488e',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters']]], + ['pardisoldlt_111',['PardisoLDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1PardisoLDLT.html',1,'Eigen']]], + ['pardisollt_112',['PardisoLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1PardisoLLT.html',1,'Eigen']]], + ['pardisolu_113',['PardisoLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1PardisoLU.html',1,'Eigen']]], + ['pardisosupport_20module_114',['PardisoSupport module',['https://eigen.tuxfamily.org/dox/group__PardisoSupport__Module.html',1,'']]], + ['parent_115',['parent',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#a1663942a3058de8c0835cdc657fd3591',1,'cv::detail::DisjointSets::parent'],['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#aae48a9dbfb39eb84cfcf2e7677e7c4d0',1,'cv::text::ERStat::parent'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#a4662282b3b556ee685a3fd4ba927a153',1,'cv::ml::DTrees::Node::parent']]], + ['parent_5fpointer_116',['parent_pointer',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_afdaacce1edb7145e0434e014f0e8685a.html#afdaacce1edb7145e0434e014f0e8685a',1,'nlohmann::json_pointer']]], + ['parentview_117',['parentView',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a1f073867d25d504a7935ac813180518a',1,'CvAbstractCamera']]], + ['parse_118',['parse',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a15018ade392a844ea32d5188d1a0b9c6.html#a15018ade392a844ea32d5188d1a0b9c6',1,'nlohmann::basic_json::parse(InputType &&i, const parser_callback_t cb=nullptr, const bool allow_exceptions=true, const bool ignore_comments=false)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad832c70af0989389a9a104c21d2d1c5c.html#ad832c70af0989389a9a104c21d2d1c5c',1,'nlohmann::basic_json::parse(IteratorType first, IteratorType last, const parser_callback_t cb=nullptr, const bool allow_exceptions=true, const bool ignore_comments=false)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a73cf15644f04fa569f50291049d1bafd.html#a73cf15644f04fa569f50291049d1bafd',1,'nlohmann::basic_json::parse(detail::span_input_adapter &&i, const parser_callback_t cb=nullptr, const bool allow_exceptions=true, const bool ignore_comments=false)']]], + ['parse_5ferror_119',['parse_error',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a555b05e9da63d486126759922685a37a.html#a555b05e9da63d486126759922685a37a',1,'nlohmann::basic_json::parse_error'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a60287e3bd85f489e04c83f7e3b76e613.html#a60287e3bd85f489e04c83f7e3b76e613',1,'nlohmann::json_sax::parse_error()']]], + ['parse_5fevent_5ft_120',['parse_event_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a24086b03c5c063849df0307f78c41c54.html#a24086b03c5c063849df0307f78c41c54',1,'nlohmann::basic_json']]], + ['parse_5fnumbers_2eh_121',['parse_numbers.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00440.html',1,'']]], + ['parseavi_122',['parseAvi',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a4c06bb278da8365befa6b0102e66ba51',1,'cv::AVIReadContainer::parseAvi(Codecs codec_)'],['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a4f53539ac4dac515adb75a4f1aa685e4',1,'cv::AVIReadContainer::parseAvi(frame_list &in_frame_list, Codecs codec_)']]], + ['parseaviwithframelist_123',['parseAviWithFrameList',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a93c6c6887e5ff4d4eb80b33d0e19b023',1,'cv::AVIReadContainer']]], + ['parsehdrllist_124',['parseHdrlList',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a4f26cdb8565eb7c0a46ae73603046624',1,'cv::AVIReadContainer']]], + ['parseindex_125',['parseIndex',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a1ee25d593d9ede33f708131980d27c8a',1,'cv::AVIReadContainer']]], + ['parseinfo_126',['parseInfo',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a695c50eebb1689055e06b0c105e12025',1,'cv::AVIReadContainer']]], + ['parsemovi_127',['parseMovi',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a2e34cdd82292614e21a05c6e7d36263d',1,'cv::AVIReadContainer']]], + ['parser_5fcallback_5ft_128',['parser_callback_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0273d074462644e5d5a7ff313ad0d742.html#a0273d074462644e5d5a7ff313ad0d742',1,'nlohmann::basic_json']]], + ['parseriff_129',['parseRiff',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ab7e82462d39dd2a75de9dc34ca9e2ed5',1,'cv::AVIReadContainer']]], + ['parsestrl_130',['parseStrl',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ac47b36db52d61f80c63946636c46142e',1,'cv::AVIReadContainer']]], + ['part_131',['Core part',['https://docs.opencv.org/4.2.0/d7/d05/group__cudacore.html',1,'']]], + ['part_20based_20models_132',['Deformable Part-based Models',['https://docs.opencv.org/4.2.0/d9/d12/group__dpm.html',1,'']]], + ['partial_20list_20of_20implemented_20layers_133',['Partial List of Implemented Layers',['https://docs.opencv.org/4.2.0/d6/d87/group__dnnLayerList.html',1,'']]], + ['partial_5fsort_134',['partial_sort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga91f25d546637f075de3958a25928b687',1,'std::partial_sort(_RandomAccessIterator __first, _RandomAccessIterator __middle, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6401ff7e25d2ef7a6119d894cb40eec0',1,'std::partial_sort(_RandomAccessIterator __first, _RandomAccessIterator __middle, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga91f25d546637f075de3958a25928b687',1,'partial_sort(_RandomAccessIterator __first, _RandomAccessIterator __middle, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6401ff7e25d2ef7a6119d894cb40eec0',1,'partial_sort(_RandomAccessIterator __first, _RandomAccessIterator __middle, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], + ['partial_5fsort_5fcopy_135',['partial_sort_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7b262260421978833cc1b1c6b3969bb4',1,'std::partial_sort_copy(_InputIterator __first, _InputIterator __last, _RandomAccessIterator __result_first, _RandomAccessIterator __result_last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaf53e3f9d5e3c9cd4d36a0801d411e324',1,'std::partial_sort_copy(_InputIterator __first, _InputIterator __last, _RandomAccessIterator __result_first, _RandomAccessIterator __result_last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7b262260421978833cc1b1c6b3969bb4',1,'partial_sort_copy(_InputIterator __first, _InputIterator __last, _RandomAccessIterator __result_first, _RandomAccessIterator __result_last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaf53e3f9d5e3c9cd4d36a0801d411e324',1,'partial_sort_copy(_InputIterator __first, _InputIterator __last, _RandomAccessIterator __result_first, _RandomAccessIterator __result_last, _Compare __comp)(Global Namespace)']]], + ['partial_5fsort_5fminimal_5fn_136',['partial_sort_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a79a53af11312c55af15998bf7a3f46d3',1,'__gnu_parallel::_Settings']]], + ['partial_5fsum_137',['partial_sum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga9151a0519f8c180edbef22197f39dd5e',1,'std::partial_sum(_InputIterator __first, _InputIterator __last, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga17bad49fa9fb1c5c41d019b16970fe9e',1,'std::partial_sum(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _BinaryOperation __binary_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga9151a0519f8c180edbef22197f39dd5e',1,'partial_sum(_InputIterator __first, _InputIterator __last, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga17bad49fa9fb1c5c41d019b16970fe9e',1,'partial_sum(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _BinaryOperation __binary_op)(Global Namespace)']]], + ['partial_5fsum_2eh_138',['partial_sum.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00944.html',1,'']]], + ['partial_5fsum_5fdilation_139',['partial_sum_dilation',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a781c6a0034d1669b90e37407e1c6d09e',1,'__gnu_parallel::_Settings']]], + ['partial_5fsum_5fminimal_5fn_140',['partial_sum_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a768fbc7a7e588eabb25fd3824c4322fb',1,'__gnu_parallel::_Settings']]], + ['partialpivlu_141',['PartialPivLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html',1,'Eigen::PartialPivLU< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a5c04818d354f94a98786d8a44cb709c6',1,'Eigen::PartialPivLU::PartialPivLU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#acf37214aebb54d0e186ae39ac6c41bdf',1,'Eigen::PartialPivLU::PartialPivLU(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a4efc917d31d0e9d76781a97509309061',1,'Eigen::PartialPivLU::PartialPivLU(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#acf892c12d8a229b32bddc3149e32e63a',1,'Eigen::PartialPivLU::PartialPivLU(Index size)']]], + ['partialpivlu_142',['partialPivLu',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a6199d8aaf26c1b8ac3097fdfa7733a1e',1,'Eigen::MatrixBase::partialPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a6199d8aaf26c1b8ac3097fdfa7733a1e',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::partialPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a6199d8aaf26c1b8ac3097fdfa7733a1e',1,'MatrixBase< Solve< Decomposition, RhsType > >::partialPivLu()']]], + ['partialreduxexpr_143',['PartialReduxExpr',['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialReduxExpr.html',1,'Eigen']]], + ['particlesnum_144',['particlesNum',['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html#a82ecefe2fc5d73bc1a935b7611a8fe56',1,'cv::TrackerSamplerPF::Params']]], + ['partition_145',['partition',['https://docs.opencv.org/4.2.0/d5/d38/group__core__cluster.html#ga2037c989e69b499c1aa271419f3a9b34',1,'partition()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga64c8d89411856cea58194aa69a3c37f3',1,'std::partition()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga64c8d89411856cea58194aa69a3c37f3',1,'partition(_ForwardIterator __first, _ForwardIterator __last, _Predicate __pred)(Global Namespace)']]], + ['partition_2eh_146',['partition.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00947.html',1,'']]], + ['partition_5fchunk_5fshare_147',['partition_chunk_share',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#aaac9b17f2715c8b9101a2905562a43d1',1,'__gnu_parallel::_Settings']]], + ['partition_5fchunk_5fsize_148',['partition_chunk_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ad796aab8446ea9eaadfbc0b7b0787c71',1,'__gnu_parallel::_Settings']]], + ['partition_5fcopy_149',['partition_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga15ed8c195c2228b62770f24b4fd9de05',1,'std::partition_copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga15ed8c195c2228b62770f24b4fd9de05',1,'partition_copy()(Global Namespace)']]], + ['partition_5fminimal_5fn_150',['partition_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ae56b6a01dc27becaa478828011527b4b',1,'__gnu_parallel::_Settings']]], + ['partition_5fpoint_151',['partition_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaca57a24221766660c3b9d83e2b3f8f97',1,'std::partition_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaca57a24221766660c3b9d83e2b3f8f97',1,'partition_point()(Global Namespace)']]], + ['parts_152',['parts',['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#a4e122399c7fa8be98a94ba25fe62ee29',1,'cv::datasets::PascalObj']]], + ['parts_20of_20eigen_153',['Experimental parts of Eigen',['https://eigen.tuxfamily.org/dox/Experimental.html',1,'']]], + ['pascalobj_154',['PascalObj',['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html',1,'cv::datasets']]], + ['pascalpart_155',['PascalPart',['https://docs.opencv.org/4.2.0/d6/d4e/structcv_1_1datasets_1_1PascalPart.html',1,'cv::datasets']]], + ['pass_156',['pass',['https://docs.opencv.org/4.2.0/dc/d02/classcv_1_1GCall.html#abfe18fdb44602c8bb442d107b7f785ac',1,'cv::GCall']]], + ['passing_20eigen_20objects_20by_20value_20to_20functions_157',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], + ['pastixldlt_158',['PastixLDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLDLT.html',1,'Eigen']]], + ['pastixllt_159',['PastixLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLLT.html',1,'Eigen']]], + ['pastixlu_160',['PastixLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLU.html',1,'Eigen']]], + ['pastixsupport_20module_161',['PaStiXSupport module',['https://eigen.tuxfamily.org/dox/group__PaStiXSupport__Module.html',1,'']]], + ['pat_162',['pat',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a51cc7ec239bc574f3ba40cd4fe5c9475',1,'cv::datasets::pat'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a51cc7ec239bc574f3ba40cd4fe5c9475',1,'pat(Global Namespace)']]], + ['pat_5ftrie_5f_2ehpp_163',['pat_trie_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01376.html',1,'']]], + ['pat_5ftrie_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_164',['pat_trie_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16703.html',1,'']]], + ['pat_5ftrie_5f_2fdebug_5ffn_5fimps_2ehpp_165',['pat_trie_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16775.html',1,'']]], + ['pat_5ftrie_5f_2ferase_5ffn_5fimps_2ehpp_166',['pat_trie_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16838.html',1,'']]], + ['pat_5ftrie_5f_2ffind_5ffn_5fimps_2ehpp_167',['pat_trie_/find_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16886.html',1,'']]], + ['pat_5ftrie_5f_2finfo_5ffn_5fimps_2ehpp_168',['pat_trie_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16970.html',1,'']]], + ['pat_5ftrie_5f_2fiterators_5ffn_5fimps_2ehpp_169',['pat_trie_/iterators_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17054.html',1,'']]], + ['pat_5ftrie_5f_2fpolicy_5faccess_5ffn_5fimps_2ehpp_170',['pat_trie_/policy_access_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17162.html',1,'']]], + ['pat_5ftrie_5f_2fr_5ferase_5ffn_5fimps_2ehpp_171',['pat_trie_/r_erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17168.html',1,'']]], + ['pat_5ftrie_5f_2frotate_5ffn_5fimps_2ehpp_172',['pat_trie_/rotate_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17210.html',1,'']]], + ['pat_5ftrie_5f_2ftrace_5ffn_5fimps_2ehpp_173',['pat_trie_/trace_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17297.html',1,'']]], + ['pat_5ftrie_5f_2ftraits_2ehpp_174',['pat_trie_/traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17315.html',1,'']]], + ['pat_5ftrie_5fbase_175',['pat_trie_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11903.html',1,'__gnu_pbds::detail']]], + ['pat_5ftrie_5fbase_2ehpp_176',['pat_trie_base.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01379.html',1,'']]], + ['pat_5ftrie_5fmap_177',['pat_trie_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html',1,'__gnu_pbds::detail']]], + ['pat_5ftrie_5ftag_178',['pat_trie_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11259.html',1,'__gnu_pbds']]], + ['patch_179',['patch',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_adcc786998f220a5b3083ee8a37c4553e.html#adcc786998f220a5b3083ee8a37c4553e',1,'nlohmann::basic_json']]], + ['patch_5fsize_5fx_180',['patch_size_x',['https://docs.opencv.org/4.2.0/d2/d04/structcv_1_1cudev_1_1DefaultGlobReducePolicy.html#a1ad0902ac493453c5843538f7fc0ded7a93d9da236bf4870be3428bb928438e5c',1,'cv::cudev::DefaultGlobReducePolicy']]], + ['patch_5fsize_5fy_181',['patch_size_y',['https://docs.opencv.org/4.2.0/d2/d04/structcv_1_1cudev_1_1DefaultGlobReducePolicy.html#a1ad0902ac493453c5843538f7fc0ded7a99411a640813e3b8dc222cae869d39c7',1,'cv::cudev::DefaultGlobReducePolicy']]], + ['patchnans_182',['patchNaNs',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga62286befb7cde3568ff8c7d14d5079da',1,'cv::patchNaNs()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga62286befb7cde3568ff8c7d14d5079da',1,'patchNaNs()(Global Namespace)']]], + ['path_183',['PATH',['https://docs.opencv.org/4.2.0/d0/da3/classcv_1_1viz_1_1WTrajectory.html#af448f4e56e68f9d7e1bd1a2c5fce691fa27fc06657f7d3061bd07d6e7192a2006',1,'cv::viz::WTrajectory']]], + ['path_184',['path',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09859.html',1,'std::experimental::filesystem::v1::path'],['https://docs.opencv.org/4.2.0/d6/d08/structcv_1_1gapi_1_1wip_1_1draw_1_1freetype__font.html#a43b1077a80176caa1c45e4a1eef21d4d',1,'cv::gapi::wip::draw::freetype_font::path']]], + ['paths_185',['Paths',['https://docs.opencv.org/4.2.0/d3/dc4/namespacecv_1_1utils.html#a8a925b06bb0e09dede483e22333ad4dd',1,'cv::utils']]], + ['paths_186',['paths',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1datasets_1_1FR__adience.html#a7b941899b9f20f8994e1a992e34bacaa',1,'cv::datasets::FR_adience::paths'],['https://docs.opencv.org/4.2.0/da/d69/classcv_1_1datasets_1_1OR__sun.html#a1645e733a08fa9e64d2375d946e3f2de',1,'cv::datasets::OR_sun::paths']]], + ['pattern_187',['pattern',['https://docs.opencv.org/4.2.0/da/d0d/tutorial_camera_calibration_pattern.html',1,'Create calibration pattern'],['https://docs.opencv.org/4.2.0/dd/db9/structcv_1_1GTransform.html#ad21c88ff36d3cb622e84df46cc06355c',1,'cv::GTransform::pattern']]], + ['pattern_20for_203d_20reconstruction_188',['Custom Calibration Pattern for 3D reconstruction',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html',1,'']]], + ['pattern_20tutorial_189',['pattern tutorial',['https://docs.opencv.org/4.2.0/db/d56/tutorial_capture_graycode_pattern.html',1,'Capture Gray code pattern tutorial'],['https://docs.opencv.org/4.2.0/d0/de8/tutorial_capture_sinusoidal_pattern.html',1,'Capture Sinusoidal pattern tutorial'],['https://docs.opencv.org/4.2.0/dc/da9/tutorial_decode_graycode_pattern.html',1,'Decode Gray code pattern tutorial']]], + ['pbackfail_190',['pbackfail',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'__gnu_cxx::enc_filebuf::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'__gnu_cxx::stdio_filebuf::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'__gnu_cxx::stdio_sync_filebuf::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'basic_filebuf< char_type, traits_type >::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'basic_streambuf< _Elem, _Tr >::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'basic_streambuf< char, _Traits >::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'basic_streambuf< char, char_traits< char > >::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'std::basic_filebuf::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'std::basic_streambuf::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'std::basic_stringbuf::pbackfail()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a164c1056fe7d6d2cf5335c55541b8b52',1,'std::wbuffer_convert::pbackfail()']]], + ['pbase_191',['pbase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'__gnu_cxx::enc_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'__gnu_cxx::enc_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'__gnu_cxx::stdio_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'__gnu_cxx::stdio_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'__gnu_cxx::stdio_sync_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'__gnu_cxx::stdio_sync_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_filebuf< char_type, traits_type >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_filebuf< char_type, traits_type >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_streambuf< _Elem, _Tr >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_streambuf< _Elem, _Tr >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_streambuf< char, _Traits >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_streambuf< char, _Traits >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_streambuf< char, char_traits< char > >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'basic_streambuf< char, char_traits< char > >::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::basic_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::basic_filebuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::basic_streambuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::basic_streambuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::basic_stringbuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::basic_stringbuf::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::wbuffer_convert::pbase() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3feb8a3ab9393e19d53e0712af6a27e2',1,'std::wbuffer_convert::pbase() const']]], + ['pbu_192',['pBU',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a4e534c3211135d64f80e9d6bbb868c10',1,'NppStInterpolationState']]], + ['pbump_193',['pbump',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'__gnu_cxx::enc_filebuf::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'__gnu_cxx::stdio_filebuf::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'__gnu_cxx::stdio_sync_filebuf::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'basic_filebuf< char_type, traits_type >::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'basic_streambuf< _Elem, _Tr >::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'basic_streambuf< char, _Traits >::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'basic_streambuf< char, char_traits< char > >::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'std::basic_filebuf::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'std::basic_streambuf::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'std::basic_stringbuf::pbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abd017296cfc054910ca7de102e6a6998',1,'std::wbuffer_convert::pbump()']]], + ['pbv_194',['pBV',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a8e0864523bcefbf127909ea15398a4d1',1,'NppStInterpolationState']]], + ['pc_195',['pc',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a172ccaaba996db5201af1c17c04a5fe8a5c598dc317cfe6ac99afeaeed18454c7',1,'cv']]], + ['pca_196',['PCA',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'Introduction to Principal Component Analysis (PCA)'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html',1,'cv::PCA'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a50ad1a87273a258055a331d5a4c63ce4',1,'cv::PCA::PCA()'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a5a7400a3dd169deb4111231a61bc2575',1,'cv::PCA::PCA(InputArray data, InputArray mean, int flags, int maxComponents=0)'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#af44683b857883856418187f24d8d19a2',1,'cv::PCA::PCA(InputArray data, InputArray mean, int flags, double retainedVariance)']]], + ['pca_5flearning_5frate_197',['pca_learning_rate',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#afd3ead64571cd315b22948e0f1f2236f',1,'cv::TrackerKCF::Params']]], + ['pcabackproject_198',['PCABackProject',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab26049f30ee8e94f7d69d82c124faafc',1,'cv::PCABackProject()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab26049f30ee8e94f7d69d82c124faafc',1,'PCABackProject()(Global Namespace)']]], + ['pcacompute_199',['PCACompute',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga4e2073c7311f292a0648f04c37b73781',1,'cv::PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, int maxComponents=0)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga27a565b31d820b05dcbcd47112176b6e',1,'cv::PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, OutputArray eigenvalues, int maxComponents=0)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0ad1147fbcdb256f2e14ae2bfb8c991d',1,'cv::PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, double retainedVariance)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa928ce9ac86ffc12b7fae3a22a3aa308',1,'cv::PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, OutputArray eigenvalues, double retainedVariance)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga4e2073c7311f292a0648f04c37b73781',1,'PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, int maxComponents=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga27a565b31d820b05dcbcd47112176b6e',1,'PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, OutputArray eigenvalues, int maxComponents=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0ad1147fbcdb256f2e14ae2bfb8c991d',1,'PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, double retainedVariance)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa928ce9ac86ffc12b7fae3a22a3aa308',1,'PCACompute(InputArray data, InputOutputArray mean, OutputArray eigenvectors, OutputArray eigenvalues, double retainedVariance)(Global Namespace)']]], + ['pcaflow_2ehpp_200',['pcaflow.hpp',['https://docs.opencv.org/4.2.0/dc/dee/pcaflow_8hpp.html',1,'']]], + ['pcaprior_201',['PCAPrior',['https://docs.opencv.org/4.2.0/d5/d5e/classcv_1_1optflow_1_1PCAPrior.html',1,'cv::optflow::PCAPrior'],['https://docs.opencv.org/4.2.0/d5/d5e/classcv_1_1optflow_1_1PCAPrior.html#a031a676ee478ca24025bece163c2c30f',1,'cv::optflow::PCAPrior::PCAPrior()']]], + ['pcaproject_202',['PCAProject',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6b9fbc7b3a99ebfd441bbec0a6bc4f88',1,'cv::PCAProject()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6b9fbc7b3a99ebfd441bbec0a6bc4f88',1,'PCAProject()(Global Namespace)']]], + ['pcibusid_203',['pciBusID',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a18cd51bd5df3d08c2c610b1b9a468d80',1,'cv::cuda::DeviceInfo']]], + ['pcideviceid_204',['pciDeviceID',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ace233d329eee91a016f682066aff170d',1,'cv::cuda::DeviceInfo']]], + ['pcidomainid_205',['pciDomainID',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8e6849afd47c911ca06c2ced22d369c7',1,'cv::cuda::DeviceInfo']]], + ['pctsignatures_206',['PCTSignatures',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html',1,'cv::xfeatures2d']]], + ['pctsignaturessqfd_207',['PCTSignaturesSQFD',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1xfeatures2d_1_1PCTSignaturesSQFD.html',1,'cv::xfeatures2d']]], + ['pd_208',['pd',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a3016479bf218847574f55b53d28ea2ea',1,'cv::dnn::DictValue']]], + ['pd_5fcaltech_209',['PD_caltech',['https://docs.opencv.org/4.2.0/da/d8d/classcv_1_1datasets_1_1PD__caltech.html',1,'cv::datasets']]], + ['pd_5fcaltech_2ehpp_210',['pd_caltech.hpp',['https://docs.opencv.org/4.2.0/dc/dc3/pd__caltech_8hpp.html',1,'']]], + ['pd_5fcaltechobj_211',['PD_caltechObj',['https://docs.opencv.org/4.2.0/dd/ded/structcv_1_1datasets_1_1PD__caltechObj.html',1,'cv::datasets']]], + ['pd_5finria_212',['PD_inria',['https://docs.opencv.org/4.2.0/d2/d61/classcv_1_1datasets_1_1PD__inria.html',1,'cv::datasets']]], + ['pd_5finria_2ehpp_213',['pd_inria.hpp',['https://docs.opencv.org/4.2.0/d2/de3/pd__inria_8hpp.html',1,'']]], + ['pd_5finriaobj_214',['PD_inriaObj',['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1datasets_1_1PD__inriaObj.html',1,'cv::datasets']]], + ['peakbitrate_215',['PeakBitrate',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a20377720033ff6ab820c3a16a58da753',1,'cv::cudacodec::EncoderParams']]], + ['pedestrian_20detection_216',['Pedestrian Detection',['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html',1,'']]], + ['peek_217',['peek',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'basic_iostream< char >::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'basic_iostream< char >::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'basic_istream< char >::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'basic_istream< char >::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'basic_istream< char, _Traits >::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'basic_istream< char, _Traits >::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_fstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_fstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_ifstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_ifstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_iostream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_iostream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_istream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_istream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_istringstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_istringstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_stringstream::peek()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2f0e75e1691608c66f634191e54ec4d9',1,'std::basic_stringstream::peek()']]], + ['peilin_2ehpp_218',['peilin.hpp',['https://docs.opencv.org/4.2.0/dd/db0/peilin_8hpp.html',1,'']]], + ['peilinnormalization_219',['PeiLinNormalization',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#ga50d064b92f63916f4162474eea22d656',1,'cv::ximgproc::PeiLinNormalization(InputArray I)'],['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#gaeef3f93a672fa5e3e20adbf6e5e32986',1,'cv::ximgproc::PeiLinNormalization(InputArray I, OutputArray T)'],['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#ga50d064b92f63916f4162474eea22d656',1,'PeiLinNormalization(InputArray I)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#gaeef3f93a672fa5e3e20adbf6e5e32986',1,'PeiLinNormalization(InputArray I, OutputArray T)(Global Namespace)']]], + ['pencilsketch_220',['pencilSketch',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#gae5930dd822c713b36f8529b21ddebd0c',1,'cv::pencilSketch()'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#gae5930dd822c713b36f8529b21ddebd0c',1,'pencilSketch(InputArray src, OutputArray dst1, OutputArray dst2, float sigma_s=60, float sigma_r=0.07f, float shade_factor=0.02f)(Global Namespace)']]], + ['per_20element_20operations_221',['Per-element Operations',['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html',1,'']]], + ['per_5felement_5ffunc_2ehpp_222',['per_element_func.hpp',['https://docs.opencv.org/4.2.0/dd/d7e/per__element__func_8hpp.html',1,'']]], + ['perceptual_20computing_20sdk_20compatible_20depth_20sensors_223',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], + ['perform_5fmorphing_224',['perform_morphing',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#a56f152a6180a2c0283a708166b1aed9d',1,'cv::cuda::FGDParams']]], + ['performance_20measurement_20and_20improvement_20techniques_225',['Performance Measurement and Improvement Techniques',['https://docs.opencv.org/4.2.0/dc/d71/tutorial_py_optimization.html',1,'']]], + ['performsegmentcpu_226',['performSegmentCpu',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#a53fac3e2d612a11a71c10d196ab94e4b',1,'cv::hfs::HfsSegment']]], + ['performsegmentgpu_227',['performSegmentGpu',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#a5a7ebdd324113f4fefcd246bbb5d90ce',1,'cv::hfs::HfsSegment']]], + ['perimeter_228',['perimeter',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a94ebcd24d58d1274a9a269bb55fb13dc',1,'cv::text::ERStat']]], + ['period_229',['period',['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html#a749ab7956a5fdb5833c2fd3b44c17275',1,'cv::videostab::MoreAccurateMotionWobbleSuppressorBase']]], + ['period_5f_230',['period_',['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html#a4ce79a10a75561b24a9ca7722c804ea4',1,'cv::videostab::MoreAccurateMotionWobbleSuppressorBase']]], + ['periodic_20noise_20removing_20filter_231',['Periodic Noise Removing Filter',['https://docs.opencv.org/4.2.0/d2/d0b/tutorial_periodic_noise_removing_filter.html',1,'']]], + ['periodic_5fnoise_5fremoving_5ffilter_2emarkdown_232',['periodic_noise_removing_filter.markdown',['https://docs.opencv.org/4.2.0/db/d31/periodic__noise__removing__filter_8markdown.html',1,'']]], + ['periodicscheduler_233',['PeriodicScheduler',['../classutil_1_1PeriodicScheduler.html',1,'util::PeriodicScheduler< Clock >'],['../classutil_1_1PeriodicScheduler.html#a6d7b387f9a7743b601aca004c7524d08',1,'util::PeriodicScheduler::PeriodicScheduler()']]], + ['periodicscheduler_3c_20std_3a_3achrono_3a_3asteady_5fclock_20_3e_234',['PeriodicScheduler< std::chrono::steady_clock >',['../classutil_1_1PeriodicScheduler.html',1,'util']]], + ['periodictask_235',['PeriodicTask',['../classutil_1_1PeriodicTask.html',1,'util::PeriodicTask< Clock >'],['../classutil_1_1PeriodicTask.html#ab7bcb7de2b55ab8cdb3fb48dccb9c229',1,'util::PeriodicTask::PeriodicTask()']]], + ['perms_236',['perms',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145',1,]]], + ['permutationbase_237',['PermutationBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html',1,'Eigen']]], + ['permutationbase_3c_20map_3c_20permutationmatrix_3c_20sizeatcompiletime_2c_20maxsizeatcompiletime_2c_20_5fstorageindex_20_3e_2c_20_5fpacketaccess_20_3e_20_3e_238',['PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html',1,'']]], + ['permutationbase_3c_20permutationmatrix_3c_20sizeatcompiletime_2c_20maxsizeatcompiletime_2c_20_5fstorageindex_20_3e_20_3e_239',['PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html',1,'']]], + ['permutationbase_3c_20permutationmatrix_3c_20sizeatcompiletime_2c_20maxsizeatcompiletime_2c_20storageindex_20_3e_20_3e_240',['PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html',1,'']]], + ['permutationbase_3c_20permutationwrapper_3c_20_5findicestype_20_3e_20_3e_241',['PermutationBase< PermutationWrapper< _IndicesType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html',1,'']]], + ['permutationmatrix_242',['PermutationMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html',1,'Eigen::PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a204b8bbba3c4d33c1a24bb60ad72b202',1,'Eigen::PermutationMatrix::PermutationMatrix(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a7ae7016a606b08573013115dcf2e56f2',1,'Eigen::PermutationMatrix::PermutationMatrix(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a0b9a4e51bea9c778a38f6e89db484af4',1,'Eigen::PermutationMatrix::PermutationMatrix(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aea29eab1fd6a6562971db7b9c04c11aa',1,'Eigen::PermutationMatrix::PermutationMatrix(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a204b8bbba3c4d33c1a24bb60ad72b202',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::PermutationMatrix(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a7ae7016a606b08573013115dcf2e56f2',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::PermutationMatrix(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a0b9a4e51bea9c778a38f6e89db484af4',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::PermutationMatrix(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aea29eab1fd6a6562971db7b9c04c11aa',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::PermutationMatrix(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a204b8bbba3c4d33c1a24bb60ad72b202',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::PermutationMatrix(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a7ae7016a606b08573013115dcf2e56f2',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::PermutationMatrix(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a0b9a4e51bea9c778a38f6e89db484af4',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::PermutationMatrix(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aea29eab1fd6a6562971db7b9c04c11aa',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::PermutationMatrix(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a204b8bbba3c4d33c1a24bb60ad72b202',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::PermutationMatrix(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a7ae7016a606b08573013115dcf2e56f2',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::PermutationMatrix(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a0b9a4e51bea9c778a38f6e89db484af4',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::PermutationMatrix(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aea29eab1fd6a6562971db7b9c04c11aa',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::PermutationMatrix(Index size)']]], + ['permutationmatrix_3c_20colsatcompiletime_2c_20maxcolsatcompiletime_20_3e_243',['PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html',1,'']]], + ['permutationmatrix_3c_20dynamic_2c_20dynamic_2c_20storageindex_20_3e_244',['PermutationMatrix< Dynamic, Dynamic, StorageIndex >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html',1,'']]], + ['permutationmatrix_3c_20rowsatcompiletime_2c_20maxrowsatcompiletime_20_3e_245',['PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html',1,'']]], + ['permutationp_246',['permutationP',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#ad8f1d7266a434c524d3e0dbcc7a0f588',1,'Eigen::FullPivLU::permutationP()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a0d52cec5e17f485a362766363ba90b02',1,'Eigen::IncompleteCholesky::permutationP()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a1c637530b3215787668a75ebb2e7b882',1,'Eigen::PartialPivLU::permutationP()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html#aff1480e595a21726beaec9a586a94d5a',1,'Eigen::SimplicialCholeskyBase::permutationP() const']]], + ['permutationpinv_247',['permutationPinv',['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html#a0e23d1f4a88c211be7098faf1cb41674',1,'Eigen::SimplicialCholeskyBase']]], + ['permutationq_248',['permutationQ',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a8d18190c7618de271cba7293f0493a36',1,'Eigen::FullPivLU']]], + ['permutationstorage_249',['PermutationStorage',['https://eigen.tuxfamily.org/dox/structEigen_1_1PermutationStorage.html',1,'Eigen']]], + ['permutationwrapper_250',['PermutationWrapper',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationWrapper.html',1,'Eigen']]], + ['permutelayer_251',['PermuteLayer',['https://docs.opencv.org/4.2.0/d2/d3c/classcv_1_1dnn_1_1PermuteLayer.html',1,'cv::dnn']]], + ['persistence_252',['XML/YAML Persistence',['https://docs.opencv.org/4.2.0/d4/da4/group__core__xml.html',1,'']]], + ['persistence_2ehpp_253',['persistence.hpp',['https://docs.opencv.org/4.2.0/d8/d14/persistence_8hpp.html',1,'']]], + ['person_254',['person',['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#a2d5afac17806cdb1ed13943f06be54a3',1,'cv::datasets::GR_skigObj::person'],['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#af3f958ba916e0d2ae312fcb0c369dffd',1,'cv::datasets::HPE_humanevaObj::person']]], + ['perspectivemap_255',['perspectiveMap',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d9fb685753febcac788c82f2375f45c',1,'cv::cudev::perspectiveMap()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d9fb685753febcac788c82f2375f45c',1,'perspectiveMap()(Global Namespace)']]], + ['perspectivemapptr_256',['PerspectiveMapPtr',['https://docs.opencv.org/4.2.0/df/d20/structcv_1_1cudev_1_1PerspectiveMapPtr.html',1,'cv::cudev']]], + ['perspectivemapptrsz_257',['PerspectiveMapPtrSz',['https://docs.opencv.org/4.2.0/de/d6d/structcv_1_1cudev_1_1PerspectiveMapPtrSz.html',1,'cv::cudev']]], + ['perspectiveremoveignoredmarginpercell_258',['perspectiveRemoveIgnoredMarginPerCell',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a2a01a662bf4718fe689d0fe23ddec69e',1,'cv::aruco::DetectorParameters']]], + ['perspectiveremovepixelpercell_259',['perspectiveRemovePixelPerCell',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a1feac9bd1d3ae9bc1cc48bcf900cf25d',1,'cv::aruco::DetectorParameters']]], + ['perspectivetransform_260',['perspectiveTransform',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad327659ac03e5fd6894b90025e6900a7',1,'cv::perspectiveTransform()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad327659ac03e5fd6894b90025e6900a7',1,'perspectiveTransform()(Global Namespace)']]], + ['pframe_261',['PFRAME',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1cudacodec_1_1EncoderCallBack.html#a438ff7f710203a94e60577c9f4a70843a5437d1ba1602eaed5049c81b18dd1472',1,'cv::cudacodec::EncoderCallBack']]], + ['pfu_262',['pFU',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a3ee911c6f9e2e3a135aaf80a072a0f5f',1,'NppStInterpolationState']]], + ['pfv_263',['pFV',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#acdf5a39b936be5ea5242700948615170',1,'NppStInterpolationState']]], + ['phase_264',['phase',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9db9ca9b4d81c3bde5677b8f64dc0137',1,'cv::phase()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga5b75ec01be06dcd6e27ada09a0d4656a',1,'cv::cuda::phase()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga3c98a8ad1054d296500220737c04d18c',1,'cv::gapi::phase()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9db9ca9b4d81c3bde5677b8f64dc0137',1,'phase(InputArray x, InputArray y, OutputArray angle, bool angleInDegrees=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga3c98a8ad1054d296500220737c04d18c',1,'phase(const GMat &x, const GMat &y, bool angleInDegrees=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga5b75ec01be06dcd6e27ada09a0d4656a',1,'phase(InputArray x, InputArray y, OutputArray angle, bool angleInDegrees=false, Stream &stream=Stream::Null())(Global Namespace)']]], + ['phase_20maps_265',['Unwrap two-dimensional phase maps',['https://docs.opencv.org/4.2.0/d9/dfb/tutorial_unwrap.html',1,'']]], + ['phase_20unwrapping_20api_266',['Phase Unwrapping API',['https://docs.opencv.org/4.2.0/df/d3a/group__phase__unwrapping.html',1,'']]], + ['phase_20unwrapping_20tutorial_267',['Phase Unwrapping tutorial',['https://docs.opencv.org/4.2.0/db/d74/tutorial_unwrap_phase_map.html',1,'']]], + ['phase_5funwrapping_2ehpp_268',['phase_unwrapping.hpp',['https://docs.opencv.org/4.2.0/d3/d22/phase__unwrapping_2phase__unwrapping_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/dee/phase__unwrapping_8hpp.html',1,'(Global Namespace)']]], + ['phase_5funwrapping_2emarkdown_269',['phase_unwrapping.markdown',['https://docs.opencv.org/4.2.0/d9/dac/phase__unwrapping_8markdown.html',1,'']]], + ['phasecorrelate_270',['phaseCorrelate',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html#ga552420a2ace9ef3fb053cd630fdb4952',1,'cv::phaseCorrelate()'],['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html#ga552420a2ace9ef3fb053cd630fdb4952',1,'phaseCorrelate()(Global Namespace)']]], + ['phaseunwrapping_271',['PhaseUnwrapping',['https://docs.opencv.org/4.2.0/d8/d83/classcv_1_1phase__unwrapping_1_1PhaseUnwrapping.html',1,'cv::phase_unwrapping']]], + ['phash_272',['PHash',['https://docs.opencv.org/4.2.0/df/d4e/classcv_1_1img__hash_1_1PHash.html',1,'cv::img_hash::PHash'],['https://docs.opencv.org/4.2.0/df/d4e/classcv_1_1img__hash_1_1PHash.html#a0635c8648c41b81c318ba248713e8a61',1,'cv::img_hash::PHash::PHash()']]], + ['phash_273',['pHash',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga5eeee1e27bc45caffe3b529ab42568e3',1,'cv::img_hash::pHash()'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga5eeee1e27bc45caffe3b529ab42568e3',1,'pHash(cv::InputArray inputArr, cv::OutputArray outputArr)(Global Namespace)']]], + ['phash_2ehpp_274',['phash.hpp',['https://docs.opencv.org/4.2.0/d1/d9c/phash_8hpp.html',1,'']]], + ['photo_20module_275',['Computational photography (photo module)',['https://docs.opencv.org/4.2.0/da/de7/tutorial_table_of_content_photo.html',1,'']]], + ['photo_20processing_20algorithms_276',['Additional photo processing algorithms',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html',1,'']]], + ['photo_2ehpp_277',['photo.hpp',['https://docs.opencv.org/4.2.0/d1/d1f/photo_2photo_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d81/photo_8hpp.html',1,'(Global Namespace)']]], + ['photocamera_3acapturedimage_3a_278',['photoCamera:capturedImage:',['https://docs.opencv.org/4.2.0/d7/d2f/protocolCvPhotoCameraDelegate_01-p.html#acf24bf3ba072058ad5a3bd3dcfad3a96',1,'CvPhotoCameraDelegate -p-p']]], + ['photocameracancel_3a_279',['photoCameraCancel:',['https://docs.opencv.org/4.2.0/d7/d2f/protocolCvPhotoCameraDelegate_01-p.html#a18228a5d5c588f2824e91b8cf0d546ca',1,'CvPhotoCameraDelegate -p-p']]], + ['photography_280',['Photography',['https://docs.opencv.org/4.2.0/d1/d0d/group__photo.html',1,'Computational Photography'],['https://docs.opencv.org/4.2.0/d0/d07/tutorial_py_table_of_contents_photo.html',1,'Computational Photography']]], + ['photography_20photo_20module_281',['Computational photography (photo module)',['https://docs.opencv.org/4.2.0/da/de7/tutorial_table_of_content_photo.html',1,'']]], + ['photoindex_282',['photoIndex',['https://docs.opencv.org/4.2.0/df/db0/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1edge.html#a222d0adffc07a280157383418a18c7a2',1,'cv::multicalib::MultiCameraCalibration::edge']]], + ['photorealistic_20rendering_283',['Non-Photorealistic Rendering',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html',1,'']]], + ['photoreceptorslocaladaptationsensitivity_284',['photoreceptorsLocalAdaptationSensitivity',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#aa943e6eafdbbeb33212199959ae251c1',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], + ['photoreceptorsspatialconstant_285',['photoreceptorsSpatialConstant',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#a5505c985b200b504bd33e7b2d63866de',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], + ['photoreceptorstemporalconstant_286',['photoreceptorsTemporalConstant',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#a1e49259e54240a826c1a38bc7a1a4c98',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], + ['photovertex_287',['photoVertex',['https://docs.opencv.org/4.2.0/df/db0/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1edge.html#a785901522deb1b419a07c2d36db9d3e3',1,'cv::multicalib::MultiCameraCalibration::edge']]], + ['pi_288',['pi',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a50aada98f5b380f4705dd9c09b5ddf7c',1,'cv::dnn::DictValue::pi'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga41255205b005025756f29372d0ad8cb3',1,'cv::softdouble::pi()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabd90e5aaea95a7ae582cc34e830fcb5e',1,'cv::softfloat::pi()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabd90e5aaea95a7ae582cc34e830fcb5e',1,'pi()(Global Namespace)']]], + ['pictype_289',['PicType',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1cudacodec_1_1EncoderCallBack.html#a438ff7f710203a94e60577c9f4a70843',1,'cv::cudacodec::EncoderCallBack']]], + ['pidcoef_5ft_290',['pidcoef_t',['../structrobot_1_1pidcoef__t.html',1,'robot']]], + ['pidcontroller_291',['PIDController',['../classcontrol_1_1PIDController.html',1,'control::PIDController< dim >'],['../classcontrol_1_1PIDController.html#ad88305ead74b819e1545be3d8fcf7c28',1,'control::PIDController::PIDController()']]], + ['pidgains_292',['PIDGains',['../structcontrol_1_1PIDGains.html',1,'control']]], + ['pidmotors_293',['pidMotors',['../namespacerobot.html#a98f16731da8ac7f980fe19c12aa3a4f8',1,'robot']]], + ['piecewise_5fconstant_5fdistribution_294',['piecewise_constant_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html',1,'std']]], + ['piecewise_5fconstruct_295',['piecewise_construct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga4be4b722e942cd646f19614bcff7a328',1,'std::piecewise_construct'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga4be4b722e942cd646f19614bcff7a328',1,'piecewise_construct(Global Namespace)']]], + ['piecewise_5fconstruct_5ft_296',['piecewise_construct_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07783.html',1,'std']]], + ['piecewise_5flinear_5fdistribution_297',['piecewise_linear_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html',1,'std']]], + ['pimpl_298',['pImpl',['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1img__hash_1_1ImgHashBase.html#a3a6b4cc6dd3279018cefdf240c93e99c',1,'cv::img_hash::ImgHashBase']]], + ['pinhole_299',['PINHOLE',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#ab2a2522a8e0bf60ee24416e0ec37ba3ea833498d4f66baf027a178b9d299cf46b',1,'cv::multicalib::MultiCameraCalibration']]], + ['pink_300',['pink',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a2bb7ce663f58eeae244dc2c4c460eeaa',1,'cv::viz::Color']]], + ['pipeline_301',['Simple Pipeline',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html',1,'']]], + ['pipeline_20with_20g_20api_302',['Face analytics pipeline with G-API',['https://docs.opencv.org/4.2.0/d8/d24/tutorial_gapi_interactive_face_detection.html',1,'']]], + ['pitch_303',['pitch',['../structkinematics_1_1jointpos__t.html#ad11455e400c0db0d05eaab13f1d369c6',1,'kinematics::jointpos_t::pitch'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#afe2cc277372b013c0a58a40e42ae8a88',1,'NCVMatrix::pitch()']]], + ['pitfalls_304',['Common pitfalls',['https://eigen.tuxfamily.org/dox/TopicPitfalls.html',1,'']]], + ['pixel_305',['pixel',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#adba2ef41119cfbb88742c646ee2e5d19',1,'cv::text::ERStat']]], + ['pixel_5fpack_5fbuffer_306',['PIXEL_PACK_BUFFER',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a830568a629457171cb07918537ec66bea04aec232cc3ac3070953ba669bee3a3a',1,'cv::ogl::Buffer']]], + ['pixel_5funpack_5fbuffer_307',['PIXEL_UNPACK_BUFFER',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a830568a629457171cb07918537ec66bea882899bdc22e1c13618c294343d4d9dc',1,'cv::ogl::Buffer']]], + ['pixels_308',['pixels',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a4ac2c208273f2d37ad1dbc22a877ebe7',1,'cv::text::ERStat']]], + ['pixelwise_20operations_309',['Graph API: Pixelwise operations',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html',1,'']]], + ['pkg_310',['pkg',['https://docs.opencv.org/4.2.0/d6/d25/structcv_1_1gapi_1_1use__only.html#ab88387d52737d3f54ffd774ced70a840',1,'cv::gapi::use_only']]], + ['plaidml_311',['plaidml',['https://docs.opencv.org/4.2.0/da/d9f/namespaceplaidml.html',1,'']]], + ['plaidml_2ehpp_312',['plaidml.hpp',['https://docs.opencv.org/4.2.0/dc/dd8/plaidml_8hpp.html',1,'']]], + ['plaidml_3a_3aedsl_313',['edsl',['https://docs.opencv.org/4.2.0/d0/da9/namespaceplaidml_1_1edsl.html',1,'plaidml']]], + ['plaidml_5fget_5fin_314',['plaidml_get_in',['https://docs.opencv.org/4.2.0/de/dc5/structcv_1_1detail_1_1plaidml__get__in.html',1,'cv::detail']]], + ['plaidml_5fget_5fin_3c_20cv_3a_3agmat_20_3e_315',['plaidml_get_in< cv::GMat >',['https://docs.opencv.org/4.2.0/dc/dc6/structcv_1_1detail_1_1plaidml__get__in_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], + ['plaidml_5fget_5fout_316',['plaidml_get_out',['https://docs.opencv.org/4.2.0/dd/d66/structcv_1_1detail_1_1plaidml__get__out.html',1,'cv::detail']]], + ['plaidml_5fget_5fout_3c_20cv_3a_3agmat_20_3e_317',['plaidml_get_out< cv::GMat >',['https://docs.opencv.org/4.2.0/db/dc2/structcv_1_1detail_1_1plaidml__get__out_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], + ['plaidmlcallhelper_318',['PlaidMLCallHelper',['https://docs.opencv.org/4.2.0/db/da8/structcv_1_1detail_1_1PlaidMLCallHelper.html',1,'cv::detail']]], + ['plaidmlcallhelper_3c_20impl_2c_20k_3a_3ainargs_2c_20k_3a_3aoutargs_20_3e_319',['PlaidMLCallHelper< Impl, K::InArgs, K::OutArgs >',['https://docs.opencv.org/4.2.0/db/da8/structcv_1_1detail_1_1PlaidMLCallHelper.html',1,'']]], + ['plaidmlcallhelper_3c_20impl_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20outs_2e_2e_2e_20_3e_20_3e_320',['PlaidMLCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... > >',['https://docs.opencv.org/4.2.0/d3/d9b/structcv_1_1detail_1_1PlaidMLCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_136b8b4137b37f2f9fd90a73d3a1d6da6.html',1,'cv::detail']]], + ['plainarray_321',['PlainArray',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65328b7d6fc10a26ff6cd5801a6a44eb',1,'Eigen::DenseBase::PlainArray'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65328b7d6fc10a26ff6cd5801a6a44eb',1,'DenseBase< ArrayWrapper< ExpressionType > >::PlainArray'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65328b7d6fc10a26ff6cd5801a6a44eb',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::PlainArray'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65328b7d6fc10a26ff6cd5801a6a44eb',1,'DenseBase< Solve< Decomposition, RhsType > >::PlainArray']]], + ['plainmatrix_322',['PlainMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa301ef39d63443e9ef0b84f47350116e',1,'Eigen::DenseBase::PlainMatrix'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa301ef39d63443e9ef0b84f47350116e',1,'DenseBase< ArrayWrapper< ExpressionType > >::PlainMatrix'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa301ef39d63443e9ef0b84f47350116e',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::PlainMatrix'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa301ef39d63443e9ef0b84f47350116e',1,'DenseBase< Solve< Decomposition, RhsType > >::PlainMatrix']]], + ['plainobject_323',['PlainObject',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aae45af9b5aca5a9caae98fd201f47cc4',1,'Eigen::DenseBase::PlainObject'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aae45af9b5aca5a9caae98fd201f47cc4',1,'DenseBase< ArrayWrapper< ExpressionType > >::PlainObject'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aae45af9b5aca5a9caae98fd201f47cc4',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::PlainObject'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aae45af9b5aca5a9caae98fd201f47cc4',1,'DenseBase< Solve< Decomposition, RhsType > >::PlainObject']]], + ['plainobjectbase_324',['PlainObjectBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen::PlainObjectBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'Eigen::PlainObjectBase::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'Eigen::PlainObjectBase::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'Eigen::PlainObjectBase::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'Eigen::PlainObjectBase::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'Eigen::PlainObjectBase::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'Eigen::PlainObjectBase::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73dca0493df0fe4f8e518e379a80cbdd',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8fa7e42fd02b266ac54d57cdc735e83d',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a520234520136dffad88301a507da4fa5',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a281044f167c388339c2d704e5d292fa5',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5b6ba62bc9d263390e81a77a44f23dd9',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab6cde095b242924b47479662b16d78b9',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::PlainObjectBase(const std::initializer_list< std::initializer_list< Scalar > > &list)']]], + ['plainobjectbase_3c_20array_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_325',['PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], + ['plainobjectbase_3c_20array_3c_20double_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_326',['PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], + ['plainobjectbase_3c_20array_3c_20index_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_327',['PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], + ['plainobjectbase_3c_20array_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_328',['PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], + ['plainobjectbase_3c_20array_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_329',['PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], + ['plainobjectbase_3c_20array_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_330',['PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], + ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_331',['PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], + ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20outputdim_2c_20outputdim_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_332',['PlainObjectBase< Matrix< _Scalar, outputDim, outputDim, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen']]], + ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20outputdim_2c_20statedim_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_333',['PlainObjectBase< Matrix< _Scalar, outputDim, stateDim, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen']]], + ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20statedim_2c_201_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_334',['PlainObjectBase< Matrix< _Scalar, stateDim, 1, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen']]], + ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20statedim_2c_20inputdim_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_335',['PlainObjectBase< Matrix< _Scalar, stateDim, inputDim, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen']]], + ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20statedim_2c_20outputdim_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_336',['PlainObjectBase< Matrix< _Scalar, stateDim, outputDim, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen']]], + ['plainobjectbase_3c_20matrix_3c_20_5fscalar_2c_20statedim_2c_20statedim_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_337',['PlainObjectBase< Matrix< _Scalar, stateDim, stateDim, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'Eigen']]], + ['plainobjectbase_3c_20matrix_3c_20complexscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_338',['PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], + ['plainobjectbase_3c_20matrix_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_339',['PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], + ['plainobjectbase_3c_20matrix_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_340',['PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], + ['plainobjectbase_3c_20matrix_3c_20scalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_341',['PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], + ['plainobjectbase_3c_20matrix_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_342',['PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html',1,'']]], + ['planar_343',['planar',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a7618c7c08cd282071e295a93080ef035',1,'cv::GMatDesc']]], + ['planar_20objects_344',['Detection of planar objects',['https://docs.opencv.org/4.2.0/dd/dd4/tutorial_detection_of_planar_objects.html',1,'']]], + ['planar_20subdivision_345',['Planar Subdivision',['https://docs.opencv.org/4.2.0/df/d5b/group__imgproc__subdiv2d.html',1,'']]], + ['planar_20tracking_346',['AKAZE and ORB planar tracking',['https://docs.opencv.org/4.2.0/dc/d16/tutorial_akaze_tracking.html',1,'']]], + ['planararmcontroller_347',['PlanarArmController',['../classcontrol_1_1PlanarArmController.html',1,'control::PlanarArmController< N >'],['../classcontrol_1_1PlanarArmController.html#a576de65dc6da492f2f2323b6b582b070',1,'control::PlanarArmController::PlanarArmController(const kinematics::ArmKinematics< 2, N > &kin_obj, const double safetyFactor)'],['../classcontrol_1_1PlanarArmController.html#ae78d49de1c594c3b18c1ec2adcdf6f8a',1,'control::PlanarArmController::PlanarArmController(PlanarArmController &&other)']]], + ['planararmfk_348',['PlanarArmFK',['../classkinematics_1_1PlanarArmFK.html',1,'kinematics::PlanarArmFK< N >'],['../classkinematics_1_1PlanarArmFK.html#aecc2f6c7b6efe51acc76d452b634325a',1,'kinematics::PlanarArmFK::PlanarArmFK()']]], + ['planeportraitprojector_349',['PlanePortraitProjector',['https://docs.opencv.org/4.2.0/df/d0d/structcv_1_1detail_1_1PlanePortraitProjector.html',1,'cv::detail']]], + ['planeportraitwarper_350',['PlanePortraitWarper',['https://docs.opencv.org/4.2.0/d9/d77/classcv_1_1detail_1_1PlanePortraitWarper.html',1,'cv::detail::PlanePortraitWarper'],['https://docs.opencv.org/4.2.0/d9/d77/classcv_1_1detail_1_1PlanePortraitWarper.html#ac710a564bf0b02738a9ea62914d31c10',1,'cv::detail::PlanePortraitWarper::PlanePortraitWarper()']]], + ['planeprojector_351',['PlaneProjector',['https://docs.opencv.org/4.2.0/d6/d1f/structcv_1_1detail_1_1PlaneProjector.html',1,'cv::detail']]], + ['planes_352',['planes',['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#add8eb6b9303aeed6dccd8a57809b6260',1,'cv::NAryMatIterator']]], + ['planewarper_353',['PlaneWarper',['https://docs.opencv.org/4.2.0/d3/d3d/classcv_1_1detail_1_1PlaneWarper.html',1,'cv::detail::PlaneWarper'],['https://docs.opencv.org/4.2.0/d0/d57/classcv_1_1PlaneWarper.html',1,'cv::PlaneWarper'],['https://docs.opencv.org/4.2.0/d3/d3d/classcv_1_1detail_1_1PlaneWarper.html#aa2ad12b1558467a7efd9763210067726',1,'cv::detail::PlaneWarper::PlaneWarper()']]], + ['planewarpergpu_354',['PlaneWarperGpu',['https://docs.opencv.org/4.2.0/d2/d1a/classcv_1_1detail_1_1PlaneWarperGpu.html',1,'cv::detail::PlaneWarperGpu'],['https://docs.opencv.org/4.2.0/d2/d1a/classcv_1_1detail_1_1PlaneWarperGpu.html#a22a65f53d44635868c9d7c3fd2e8a676',1,'cv::detail::PlaneWarperGpu::PlaneWarperGpu()']]], + ['platform_355',['Platform',['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html',1,'cv::ocl::Platform'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#a15264d2fcab82e296e46418c783144f5',1,'cv::ocl::Platform::Platform()'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#a0af32b909ddf12194505e1c7caf1960b',1,'cv::ocl::Platform::Platform(const Platform &p)']]], + ['platforminfo_356',['PlatformInfo',['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html',1,'cv::ocl::PlatformInfo'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#a16992a45eda7745828254c0aed74d843',1,'cv::ocl::PlatformInfo::PlatformInfo()'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#ae50bb580fd5041a48f0241821adecd73',1,'cv::ocl::PlatformInfo::PlatformInfo(void *id)'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#ac1cc4c6aa05ff9e3e914cb52a3c02be1',1,'cv::ocl::PlatformInfo::PlatformInfo(const PlatformInfo &i)']]], + ['playentityanimation_357',['playEntityAnimation',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a4cfc8f8d671e0cc37686ff34db0ddaa5',1,'cv::ovis::WindowScene']]], + ['plot_20analyze_358',['Plot Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], + ['plot_20function_20for_20mat_20data_359',['Plot function for Mat data',['https://docs.opencv.org/4.2.0/db/dfe/group__plot.html',1,'']]], + ['plot_2ehpp_360',['plot.hpp',['https://docs.opencv.org/4.2.0/dc/dc0/plot_8hpp.html',1,'']]], + ['plot2d_361',['Plot2d',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html',1,'cv::plot']]], + ['plugin_20cdt_362',['Using OpenCV with Eclipse (plugin CDT)',['https://docs.opencv.org/4.2.0/d7/d16/tutorial_linux_eclipse.html',1,'']]], + ['plugins_363',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], + ['plus_364',['plus',['https://docs.opencv.org/4.2.0/d4/dd0/structcv_1_1cudev_1_1plus.html',1,'cv::cudev::plus< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07355.html',1,'std::plus< class >']]], + ['plusdelta_365',['plusDelta',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a364babc688c58ba62ea0cad61a65f07b',1,'cv::LineIterator']]], + ['plusstep_366',['plusStep',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#adb7f1c0c3e722d9e87230b92e7b9f773',1,'cv::LineIterator']]], + ['pnewframe_367',['pNewFrame',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#ae8166442221b4a0c8e165e28df97de98',1,'NppStInterpolationState']]], + ['pnorm_368',['pnorm',['https://docs.opencv.org/4.2.0/dc/df8/classcv_1_1dnn_1_1NormalizeBBoxLayer.html#a3b07f3df5e36c8909fb444bb512614f5',1,'cv::dnn::NormalizeBBoxLayer']]], + ['pnsr_20and_20ssim_20on_20the_20gpu_369',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], + ['pod_5fchar_5ftraits_2eh_370',['pod_char_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01067.html',1,'']]], + ['point_371',['Point',['https://docs.opencv.org/4.2.0/d4/dd6/classcv_1_1gapi_1_1own_1_1Point.html',1,'cv::gapi::own::Point'],['https://docs.opencv.org/4.2.0/d4/dd6/classcv_1_1gapi_1_1own_1_1Point.html#a780e84b7451bd70073cd3b1e5990ef2f',1,'cv::gapi::own::Point::Point()=default'],['https://docs.opencv.org/4.2.0/d4/dd6/classcv_1_1gapi_1_1own_1_1Point.html#ad16b16171e1478ac547a9175ea2b293c',1,'cv::gapi::own::Point::Point(int _x, int _y)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1e83eafb2d26b3c93f09e8338bcab192',1,'cv::Point'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1e83eafb2d26b3c93f09e8338bcab192',1,'Point(Global Namespace)']]], + ['point_20arithmetic_372',['Decimal Floating-Point Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01520.html',1,'']]], + ['point_20polygon_20test_373',['Point Polygon Test',['https://docs.opencv.org/4.2.0/dc/d48/tutorial_point_polygon_test.html',1,'']]], + ['point2d_374',['Point2d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga32986d8c6fd05949688352abd112509f',1,'cv::Point2d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga32986d8c6fd05949688352abd112509f',1,'Point2d(Global Namespace)']]], + ['point2f_375',['Point2f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7d080aa40de011e4410bca63385ffe2a',1,'cv::Point2f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga7d080aa40de011e4410bca63385ffe2a',1,'Point2f(Global Namespace)']]], + ['point2i_376',['Point2i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0f70b52f0c0b119f7ed2448ffebdc144',1,'cv::Point2i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0f70b52f0c0b119f7ed2448ffebdc144',1,'Point2i(Global Namespace)']]], + ['point2l_377',['Point2l',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2f6c21f7cbd3a08bfc6467fd20df2f7e',1,'cv::Point2l'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2f6c21f7cbd3a08bfc6467fd20df2f7e',1,'Point2l(Global Namespace)']]], + ['point3_5f_378',['Point3_',['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html',1,'cv::Point3_< _Tp >'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a9e4715523bb9b888741fd72d2b21b003',1,'cv::Point3_::Point3_()'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a41a67894b57b08f9e944b845d2da007a',1,'cv::Point3_::Point3_(_Tp _x, _Tp _y, _Tp _z)'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#adff6a4bdbf71b83020d60a98765c022c',1,'cv::Point3_::Point3_(const Point3_ &pt)'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a6b2fe9e24c2ecdf0a288af15a187bbee',1,'cv::Point3_::Point3_(Point3_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a3c76e74b2393c19cef8f6c0ecd292241',1,'cv::Point3_::Point3_(const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a4ce6bcc3138662a2b4abb589120b25fb',1,'cv::Point3_::Point3_(const Vec< _Tp, 3 > &v)']]], + ['point3d_379',['Point3d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga17f8af95b76535bd387f4909850c8810',1,'cv::Point3d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga17f8af95b76535bd387f4909850c8810',1,'Point3d(Global Namespace)']]], + ['point3f_380',['Point3f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3d79ceeb4419bccd0308dfdf1cd31435',1,'cv::Point3f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3d79ceeb4419bccd0308dfdf1cd31435',1,'Point3f(Global Namespace)']]], + ['point3i_381',['Point3i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gac4ae8f2fb37ecb4b5d9268f17e46a18e',1,'cv::Point3i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gac4ae8f2fb37ecb4b5d9268f17e46a18e',1,'Point3i(Global Namespace)']]], + ['point_5f_382',['Point_',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'cv::Point_< _Tp >'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a415ac41e8676210b06bcfaf23d7e6105',1,'cv::Point_::Point_()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a8db927bb4ec0aa348367566cb6219c0f',1,'cv::Point_::Point_(_Tp _x, _Tp _y)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a58704d8c14d03c1fc738d87f6bf3d35c',1,'cv::Point_::Point_(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#afdc45cc80e589ff60b842782569f9304',1,'cv::Point_::Point_(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3d82eb725fc94c259b4467db3eb2f17c',1,'cv::Point_::Point_(const Size_< _Tp > &sz)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a60730a6fd845368d2323f62a186d8fe7',1,'cv::Point_::Point_(const Vec< _Tp, 2 > &v)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a415ac41e8676210b06bcfaf23d7e6105',1,'Point_< double >::Point_()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a8db927bb4ec0aa348367566cb6219c0f',1,'Point_< double >::Point_(double _x, double _y)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a58704d8c14d03c1fc738d87f6bf3d35c',1,'Point_< double >::Point_(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#afdc45cc80e589ff60b842782569f9304',1,'Point_< double >::Point_(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3d82eb725fc94c259b4467db3eb2f17c',1,'Point_< double >::Point_(const Size_< double > &sz)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a60730a6fd845368d2323f62a186d8fe7',1,'Point_< double >::Point_(const Vec< double, 2 > &v)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a415ac41e8676210b06bcfaf23d7e6105',1,'Point_< float >::Point_()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a8db927bb4ec0aa348367566cb6219c0f',1,'Point_< float >::Point_(float _x, float _y)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a58704d8c14d03c1fc738d87f6bf3d35c',1,'Point_< float >::Point_(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#afdc45cc80e589ff60b842782569f9304',1,'Point_< float >::Point_(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3d82eb725fc94c259b4467db3eb2f17c',1,'Point_< float >::Point_(const Size_< float > &sz)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a60730a6fd845368d2323f62a186d8fe7',1,'Point_< float >::Point_(const Vec< float, 2 > &v)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a415ac41e8676210b06bcfaf23d7e6105',1,'Point_< int >::Point_()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a8db927bb4ec0aa348367566cb6219c0f',1,'Point_< int >::Point_(int _x, int _y)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a58704d8c14d03c1fc738d87f6bf3d35c',1,'Point_< int >::Point_(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#afdc45cc80e589ff60b842782569f9304',1,'Point_< int >::Point_(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a3d82eb725fc94c259b4467db3eb2f17c',1,'Point_< int >::Point_(const Size_< int > &sz)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a60730a6fd845368d2323f62a186d8fe7',1,'Point_< int >::Point_(const Vec< int, 2 > &v)']]], + ['point_5f_3c_20double_20_3e_383',['Point_< double >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'']]], + ['point_5f_3c_20float_20_3e_384',['Point_< float >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'cv::Point_< float >'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'Point_< float >']]], + ['point_5f_3c_20int_20_3e_385',['Point_< int >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'cv::Point_< int >'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'Point_< int >']]], + ['point_5fconst_5fiterator_5f_386',['point_const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html',1,'point_const_iterator_'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a2cf6f17c026eaa0ba79e8e3c4a3e5d7b',1,'point_const_iterator_::point_const_iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#ada6e22f4de631b12adb1b421764f5f3b',1,'point_const_iterator_::point_const_iterator_(const point_const_iterator_ &other)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#af9880948052666182bce3dec61ba6b5b',1,'point_const_iterator_::point_const_iterator_(const point_iterator_ &other)']]], + ['point_5finvalidation_5fguarantee_387',['point_invalidation_guarantee',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11199.html',1,'__gnu_pbds']]], + ['point_5fiterator_2ehpp_388',['point_iterator.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01463.html',1,'']]], + ['point_5fiterator_5f_389',['point_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html',1,'point_iterator_'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a3115c68fed82f555c6ae0d01e3d50caf',1,'point_iterator_::point_iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a74dce2de293ba5005f3a1bf007926bff',1,'point_iterator_::point_iterator_(const point_iterator_ &other)']]], + ['point_5fiterators_2ehpp_390',['point_iterators.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01223.html',1,'']]], + ['point_5fpolygon_5ftest_2emarkdown_391',['point_polygon_test.markdown',['https://docs.opencv.org/4.2.0/dc/ddd/point__polygon__test_8markdown.html',1,'']]], + ['point_5fsize_392',['POINT_SIZE',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acae2641145d37d70d4f6fa20344295d353',1,'cv::viz::POINT_SIZE'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acae2641145d37d70d4f6fa20344295d353',1,'POINT_SIZE(Global Namespace)']]], + ['pointat_393',['pointAt',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a925fd2bd7ce6927de196859f2f5bec41',1,'Eigen::ParametrizedLine']]], + ['pointdistribution_394',['PointDistribution',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#aa2a27f17a1a30fad4c54c248b77777e0',1,'cv::xfeatures2d::PCTSignatures']]], + ['pointee_5ftype_395',['pointee_type',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a7c679319f03206bc9c7f9a9561f01a2c',1,'cv::cudev::TypeTraits']]], + ['pointer_396',['pointer',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#ae28c6dc959d3f3480d71ada0165045ed',1,'cv::Allocator::pointer'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#abcc6516506c2198b43fad771c492b82d',1,'cv::MatConstIterator::pointer'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a60653ac7f1a885697abe8da0b5cb040b',1,'cv::MatConstIterator_::pointer'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#aa81cd9de718ad0ea55fa6bda0d66485c',1,'cv::MatIterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#a0907bb639cf9ac29dab204626ec12377',1,'__gnu_pbds::detail::binary_heap_const_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#abd81453d36a2f45a3609f24f0aa72fc7',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#a1db8d2d6a17d1ede94fa15d0d6056460',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#ad53a8fcb73619f92271d7972614ddde1',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a4931a231115cbef628c29b147a7d7336',1,'allocator_traits< _Tp_alloc_type >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#a138b64767ee1c612debd902ae852f055',1,'const_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< input_iterator_tag, _CharT, _Traits::off_type, _CharT *, _CharT >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< input_iterator_tag, _Tp, _Dist, const _Tp *, const _Tp & >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< iterator_traits< _Iterator >::iterator_category, iterator_traits< _Iterator >::value_type, iterator_traits< _Iterator >::difference_type, iterator_traits< _Iterator >::pointer, iterator_traits< _Iterator >::reference >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< output_iterator_tag, void, void, void, void >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< std::output_iterator_tag, void, void, void, void >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< std::random_access_iterator_tag, _CharT >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'iterator< std::random_access_iterator_tag, bool >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a5e8e32e609074706bc1124c6f143dcee',1,'iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a0e68152e66e7d8c3c236b2e120452564',1,'point_const_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a1db05c0220024671689e8f0110314c58',1,'point_iterator_::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a4931a231115cbef628c29b147a7d7336',1,'std::allocator_traits::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a3203247b206cbdb36c897d1e8d82e8e8',1,'std::allocator_traits< allocator< _Tp > >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::back_insert_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::front_insert_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::insert_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::istream_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::istreambuf_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::ostream_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::ostreambuf_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06311.html#a7f43cc1c2c600c67cef1972c4618b357',1,'std::pointer_traits::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06323.html#a662e7c9fa1e9ba89bee4545c22aa3e5e',1,'std::pointer_traits< _Tp * >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a69bffe0bd881194df5ff48fec79066de',1,'std::raw_storage_iterator::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab09384f7a9772d0e8c6175b572db898d',1,'std::set::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab09384f7a9772d0e8c6175b572db898d',1,'std::set::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ac0072ca4cb745124af7e8ae199b017c5',1,'std::unordered_map::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ac0072ca4cb745124af7e8ae199b017c5',1,'std::unordered_map::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aa9c05aec6bb3f18770d191869543334a',1,'std::unordered_multimap::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aa9c05aec6bb3f18770d191869543334a',1,'std::unordered_multimap::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0fd1cffa71f49d5bcea5c9fa1cb36312',1,'std::unordered_multiset::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0fd1cffa71f49d5bcea5c9fa1cb36312',1,'std::unordered_multiset::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#af18aca91916dd9537f3c33cd7746b0f4',1,'std::unordered_set::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#af18aca91916dd9537f3c33cd7746b0f4',1,'std::unordered_set::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ac0072ca4cb745124af7e8ae199b017c5',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ac0072ca4cb745124af7e8ae199b017c5',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::pointer'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a42e5c23402f4c2e1df487e1d102bc5fa.html#a42e5c23402f4c2e1df487e1d102bc5fa',1,'nlohmann::basic_json::pointer'],['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a97e8300b5eafd937dbb1315705f7102b',1,'cv::viz::MouseEvent::pointer']]], + ['pointer_20abstractions_397',['Pointer Abstractions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html',1,'']]], + ['pointer_2eh_398',['pointer.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01070.html',1,'']]], + ['pointer_5fto_399',['pointer_to',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06323.html#a8b9820e4bb36f07f95614134ce18a058',1,'std::pointer_traits< _Tp * >']]], + ['pointer_5fto_5fbinary_5ffunction_400',['pointer_to_binary_function',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07599.html',1,'std']]], + ['pointer_5fto_5funary_5ffunction_401',['pointer_to_unary_function',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07595.html',1,'std']]], + ['pointer_5ftraits_402',['pointer_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06311.html',1,'std']]], + ['pointer_5ftraits_3c_20_5ftp_20_2a_20_3e_403',['pointer_traits< _Tp * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06323.html',1,'std']]], + ['pointers_20to_20functions_404',['Adaptors for pointers to functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html',1,'']]], + ['pointers_20to_20members_405',['Adaptors for pointers to members',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01511.html',1,'']]], + ['pointpolygontest_406',['pointPolygonTest',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga1a539e8db2135af2566103705d7a5722',1,'cv::pointPolygonTest()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga1a539e8db2135af2566103705d7a5722',1,'pointPolygonTest()(Global Namespace)']]], + ['points_407',['POINTS',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8b467f66c33c13df37f24aa3f1196f14',1,'cv::ogl::POINTS'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8b467f66c33c13df37f24aa3f1196f14',1,'POINTS(Global Namespace)']]], + ['points_408',['points',['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#aff9d551d70bb7a2d7dfba4c1cce5c01a',1,'cv::gapi::wip::draw::Poly::points'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a69d648b086f26dbce0029facae9bfb2d',1,'cv::RotatedRect::points()']]], + ['pointsingrid_409',['pointsInGrid',['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#aa706613abb50ade9d32fff80b84dbfe0',1,'cv::TrackerMedianFlow::Params']]], + ['poisson_20distributions_410',['Poisson Distributions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html',1,'']]], + ['poisson_5fdistribution_411',['poisson_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html',1,'std']]], + ['polar_412',['polar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga6310fbff4c2a4056654d332fc0e68f04',1,'std::polar()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga6310fbff4c2a4056654d332fc0e68f04',1,'polar()(Global Namespace)']]], + ['polartocart_413',['polarToCart',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga581ff9d44201de2dd1b40a50db93d665',1,'cv::polarToCart()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga01516a286a329c303c2db746513dd9df',1,'cv::cuda::polarToCart()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gae523b4bd51ddcca2833c9aebbd7fe5a4',1,'cv::gapi::polarToCart()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga581ff9d44201de2dd1b40a50db93d665',1,'polarToCart(InputArray magnitude, InputArray angle, OutputArray x, OutputArray y, bool angleInDegrees=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gae523b4bd51ddcca2833c9aebbd7fe5a4',1,'polarToCart(const GMat &magnitude, const GMat &angle, bool angleInDegrees=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga01516a286a329c303c2db746513dd9df',1,'polarToCart(InputArray magnitude, InputArray angle, OutputArray x, OutputArray y, bool angleInDegrees=false, Stream &stream=Stream::Null())(Global Namespace)']]], + ['policy_20based_20data_20structures_414',['Policy-Based Data Structures',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01536.html',1,'']]], + ['policy_20classes_415',['Policy Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01531.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01535.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01529.html',1,'Base and Policy Classes']]], + ['poly_416',['POLY',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56a5fa32d793cd5f5d0bf64f55bb94a3f2e',1,'cv::ml::SVM']]], + ['poly_417',['Poly',['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html',1,'cv::gapi::wip::draw::Poly'],['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#a788badaaca4373e92cebaac609a20690',1,'cv::gapi::wip::draw::Poly::Poly()']]], + ['polygon_418',['POLYGON',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8c8c07e1f038e9fe452b06fb80d15c10',1,'cv::ogl::POLYGON'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8c8c07e1f038e9fe452b06fb80d15c10',1,'POLYGON(Global Namespace)']]], + ['polygon_20test_419',['Point Polygon Test',['https://docs.opencv.org/4.2.0/dc/d48/tutorial_point_polygon_test.html',1,'']]], + ['polygonalapproxaccuracyrate_420',['polygonalApproxAccuracyRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a4d77731cb95dcf9bb1cebf82573fc8eb',1,'cv::aruco::DetectorParameters']]], + ['polygons_421',['polygons',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#ac4482e5c832f2bd24bb697c340eaf853',1,'cv::viz::Mesh']]], + ['polylines_422',['polylines',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga1ea127ffbbb7e0bfc4fd6fd2eb64263c',1,'cv::polylines(InputOutputArray img, const Point *const *pts, const int *npts, int ncontours, bool isClosed, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaa3c25f9fb764b6bef791bf034f6e26f5',1,'cv::polylines(InputOutputArray img, InputArrayOfArrays pts, bool isClosed, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga1ea127ffbbb7e0bfc4fd6fd2eb64263c',1,'polylines(InputOutputArray img, const Point *const *pts, const int *npts, int ncontours, bool isClosed, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaa3c25f9fb764b6bef791bf034f6e26f5',1,'polylines(InputOutputArray img, InputArrayOfArrays pts, bool isClosed, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)']]], + ['polynomial_5fk1_423',['polynomial_k1',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#aa74e53f61a182e7c832d21c21739f14d',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['polynomial_5fk2_424',['polynomial_k2',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#aebaf73bf5121e7688b027b0bae218074',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['polynomial_5fk3_425',['polynomial_k3',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a3ba0193b4c12ae3dd2fa3edd34ee0e3b',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['polynomial_5fp1_426',['polynomial_p1',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#adb06d303c46a5932e43d683a12130219',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['polynomial_5fp2_427',['polynomial_p2',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#aeea8973777e2e1264a74e858f2f2f555',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['pool_428',['pool',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#ac12e3852d9f4482a1069703bc124868d',1,'cv::SparseMat::Hdr']]], + ['pool_5fallocator_2eh_429',['pool_allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01073.html',1,'']]], + ['pooledsize_430',['pooledSize',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a8343d4efd5c253de967ac68000ab2b7b',1,'cv::dnn::PoolingLayer']]], + ['poolinglayer_431',['PoolingLayer',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html',1,'cv::dnn']]], + ['poolkernel_432',['poolKernel',['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html#a072352f6d14ae4d334726fbbc9b20cd9',1,'cv::dnn::MaxUnpoolLayer']]], + ['poolpad_433',['poolPad',['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html#ace235835cca6ba7b807e8542a8ea9bf1',1,'cv::dnn::MaxUnpoolLayer']]], + ['poolstride_434',['poolStride',['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html#a8e1d6155038314c33128a01d6e2472e9',1,'cv::dnn::MaxUnpoolLayer']]], + ['pop_435',['pop',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a16b93d714717c5af52a14ebd6fec11b7',1,'stack< _StateSeqT >::pop()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#a935091a0132d887f9d3f87686c5598ac',1,'std::priority_queue::pop()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#ab918d7f862088e93a884cffae6dd9058',1,'std::queue::pop()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a16b93d714717c5af52a14ebd6fec11b7',1,'std::stack::pop()']]], + ['pop_5fback_436',['pop_back',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a88bbb01901fdfe3f1d0592c592e8757c',1,'cv::Mat::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#afa3b9e5ebf3b075576d5f9d8a4b9aa18',1,'__gnu_cxx::__versa_string::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#aff5854a49d63fcd08aae08eb282361e7',1,'__gnu_parallel::_RestrictedBoundedConcurrentQueue::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#aff5854a49d63fcd08aae08eb282361e7',1,'_RestrictedBoundedConcurrentQueue< pair< _RAIter, _RAIter > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< _CharT >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< _CharT, _Traits, _Allocator >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< char >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< char, char_traits< char >, _Byte_alloc >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< char_type, _Traits, _Alloc >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'basic_string< value_type >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a2299790b7c0080b2652ba374a2ea68fc',1,'deque< _StateSeqT >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a437f35446fc4e342d4df581335191a69',1,'list< __inp, __rebind_inp >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'match_results< _Bi_iter >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a570874e864550fff0d314ee635afba9c',1,'std::basic_string::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a2299790b7c0080b2652ba374a2ea68fc',1,'std::deque::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a437f35446fc4e342d4df581335191a69',1,'std::list::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'std::match_results::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'std::vector::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< __diff_type >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _CharClassT >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _CharT >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _Cmpt >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _Node *, _Nodeptr_Alloc >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _RealType >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _State< _TraitsT::char_type > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< _StringT >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< block_type, allocator_type >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< Catalog_info * >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< double >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< int >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< result_type >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< size_t >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< std::pair< _BiIter, int > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< std::pair< _StateIdT, std::vector > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< std::pair< _StrTransT, _StrTransT > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< sub_match< _Bi_iter >, _Alloc >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::pop_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a99e26d28529b0d7e6dfc3aff0400e8bd',1,'vector< sub_match< _BiIter >, _Alloc >::pop_back()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a4b1ee4d511ca195bed896a3da47e264c.html#a4b1ee4d511ca195bed896a3da47e264c',1,'nlohmann::json_pointer::pop_back()']]], + ['pop_5ffront_437',['pop_front',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#a4b760899cefaccb86586c447b12c4cc3',1,'__gnu_parallel::_RestrictedBoundedConcurrentQueue::pop_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#a4b760899cefaccb86586c447b12c4cc3',1,'_RestrictedBoundedConcurrentQueue< pair< _RAIter, _RAIter > >::pop_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a3f5c33f2728f70a589e11a2e8b013e78',1,'deque< _StateSeqT >::pop_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad744f7f3b84fc57c973ed2d3bb25a33e',1,'list< __inp, __rebind_inp >::pop_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a3f5c33f2728f70a589e11a2e8b013e78',1,'std::deque::pop_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ace75c01c591425341e21b6404e7f9e90',1,'std::forward_list::pop_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad744f7f3b84fc57c973ed2d3bb25a33e',1,'std::list::pop_front()']]], + ['pop_5fheap_438',['pop_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga92aecc13151c6b58598e3dd9e54064b7',1,'std::pop_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga27b771598145e151f01281b5cb0fdbbb',1,'std::pop_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga92aecc13151c6b58598e3dd9e54064b7',1,'pop_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga27b771598145e151f01281b5cb0fdbbb',1,'pop_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], + ['popcounttable_439',['popCountTable',['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1b8c26bf1cd9b597cdb9f20501a72f76',1,'cv::popCountTable'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1b8c26bf1cd9b597cdb9f20501a72f76',1,'popCountTable(Global Namespace)']]], + ['portcfg_440',['PortCfg',['https://docs.opencv.org/4.2.0/dd/d98/structcv_1_1gapi_1_1ie_1_1PortCfg.html',1,'cv::gapi::ie']]], + ['porting_20anisotropic_20image_20segmentation_20on_20g_20api_441',['Porting anisotropic image segmentation on G-API',['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'']]], + ['porting_5fanisotropic_5fsegmentation_2emarkdown_442',['porting_anisotropic_segmentation.markdown',['https://docs.opencv.org/4.2.0/da/d38/porting__anisotropic__segmentation_8markdown.html',1,'']]], + ['pos_443',['POS',['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba5d7a482a7505fa7d961f2e61643b7bc1',1,'cv::datasets::POS'],['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba5d7a482a7505fa7d961f2e61643b7bc1',1,'POS(Global Namespace)']]], + ['pos_444',['pos',['https://docs.opencv.org/4.2.0/d4/d6a/structcv_1_1optflow_1_1GPCPatchSample.html#aa1974f4d48d7c895fe29447d29696396',1,'cv::optflow::GPCPatchSample::pos'],['https://docs.opencv.org/4.2.0/d8/d7d/structcv_1_1datasets_1_1IR__robotObj.html#a3fce07cd1c3d3087d39099669651cab2',1,'cv::datasets::IR_robotObj::pos'],['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a1b88e497f772a9b1c18b66523b75efc9',1,'NppStInterpolationState::pos'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#afeddb548b519ef727e3d07b2361cd8e1',1,'cv::LineIterator::pos()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a85189ac66049666ba8cb89540fef5a63',1,'cv::MatConstIterator::pos() const'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ab64bff4ef3fbbb286699ce294871624a',1,'cv::MatConstIterator::pos(int *_idx) const'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#add5eb752db0027a38d82fa6e7b71af3d',1,'cv::MatConstIterator_::pos()']]], + ['pos_5fformat_445',['pos_format',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ae2069e06feb0ddbc8d8ca90a4ef647ea',1,'std::moneypunct::pos_format() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ae2069e06feb0ddbc8d8ca90a4ef647ea',1,'std::moneypunct::pos_format() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ae2069e06feb0ddbc8d8ca90a4ef647ea',1,'std::moneypunct_byname::pos_format() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ae2069e06feb0ddbc8d8ca90a4ef647ea',1,'std::moneypunct_byname::pos_format() const']]], + ['pos_5ftype_446',['pos_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a1a7a5dbd05bfd3ebcc7a4febd35e58d9',1,'basic_ios< char, _Traits >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a1a7a5dbd05bfd3ebcc7a4febd35e58d9',1,'basic_ios< char, _Traits >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'basic_streambuf< _Elem, _Tr >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'basic_streambuf< _Elem, _Tr >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'basic_streambuf< char, _Traits >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'basic_streambuf< char, _Traits >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'basic_streambuf< char, char_traits< char > >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'basic_streambuf< char, char_traits< char > >::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a1a7a5dbd05bfd3ebcc7a4febd35e58d9',1,'std::basic_ios::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a1a7a5dbd05bfd3ebcc7a4febd35e58d9',1,'std::basic_ios::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'std::basic_streambuf::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'std::basic_streambuf::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'std::wbuffer_convert::pos_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5bc758d8b84fa134386d3ab683b880aa',1,'std::wbuffer_convert::pos_type']]], + ['pose_447',['pose',['https://docs.opencv.org/4.2.0/dd/dbd/structcv_1_1datasets_1_1pose.html',1,'cv::datasets::pose'],['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#a96deeb2b971ea1d9d47188f39d64118a',1,'cv::datasets::GR_skigObj::pose'],['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#ad90bbb2454858374c66f12016a85380b',1,'cv::datasets::PascalObj::pose'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a20e16c79d3e967f864641d0e618284a5',1,'cv::ppf_match_3d::Pose3D::pose'],['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html#af373b82a65b00e9d632317b47e6cf0f2',1,'cv::multicalib::MultiCameraCalibration::vertex::pose']]], + ['pose_20estimation_448',['Pose Estimation',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'CNN for 3D Object Classification and Pose Estimation'],['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html',1,'Human Pose Estimation'],['https://docs.opencv.org/4.2.0/d7/d53/tutorial_py_pose.html',1,'Pose Estimation']]], + ['pose_20estimation_20api_449',['3D object recognition and pose estimation API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'']]], + ['pose_20estimation_20of_20a_20textured_20object_450',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], + ['pose_20of_20a_20widget_451',['Pose of a widget',['https://docs.opencv.org/4.2.0/d8/df0/tutorial_widget_pose.html',1,'']]], + ['pose3d_452',['Pose3D',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html',1,'cv::ppf_match_3d::Pose3D'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#afb35d62e7106cecffb6ab166f3baf606',1,'cv::ppf_match_3d::Pose3D::Pose3D()'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a2af6a081884463b2deb382ae9aef5934',1,'cv::ppf_match_3d::Pose3D::Pose3D(double Alpha, size_t ModelIndex=0, size_t NumVotes=0)']]], + ['pose3dptr_453',['Pose3DPtr',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaace349a5dbee5aa24dd68d8f57518902',1,'cv::ppf_match_3d::Pose3DPtr'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaace349a5dbee5aa24dd68d8f57518902',1,'Pose3DPtr(Global Namespace)']]], + ['pose_5f3d_2ehpp_454',['pose_3d.hpp',['https://docs.opencv.org/4.2.0/d8/d9d/pose__3d_8hpp.html',1,'']]], + ['posecluster3d_455',['PoseCluster3D',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html',1,'cv::ppf_match_3d::PoseCluster3D'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a404b98cb537684789cd9b5a06d554087',1,'cv::ppf_match_3d::PoseCluster3D::PoseCluster3D()'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a0a5fd1b66f5c16a51d9afedf32fbac83',1,'cv::ppf_match_3d::PoseCluster3D::PoseCluster3D(Pose3DPtr newPose)'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#ae1bb2cca75814df5badae55fffdc601d',1,'cv::ppf_match_3d::PoseCluster3D::PoseCluster3D(Pose3DPtr newPose, int newId)']]], + ['posecluster3dptr_456',['PoseCluster3DPtr',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga89a4263e9791e1a3c81f4403cd0ad5a3',1,'cv::ppf_match_3d::PoseCluster3DPtr'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga89a4263e9791e1a3c81f4403cd0ad5a3',1,'PoseCluster3DPtr(Global Namespace)']]], + ['poselist_457',['poseList',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a84383c0098dac446b5ef9338a2c294ba',1,'cv::ppf_match_3d::PoseCluster3D']]], + ['posesarray_458',['posesArray',['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html#abbc38afefaaddd2a451a62e8419581a4',1,'cv::datasets::SLAM_kittiObj']]], + ['posetype_459',['poseType',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ga82775e152f8a74c5fe06f5a7343e0233',1,'cv::datasets::poseType'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ga82775e152f8a74c5fe06f5a7343e0233',1,'poseType(Global Namespace)']]], + ['position_460',['position',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a258ebf7a862afc9be1ef8b188393b298',1,'match_results< _Bi_iter >::position(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a258ebf7a862afc9be1ef8b188393b298',1,'match_results< _Bi_iter >::position(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a258ebf7a862afc9be1ef8b188393b298',1,'std::match_results::position()']]], + ['position_5fthreshold_461',['position_threshold',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a7b87b6bec0033ccb112f1ea211be2e1f',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['positionsvector_462',['PositionsVector',['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#a78fa153c66224921eed2567e91aec1ba',1,'cv::DetectionBasedTracker::TrackedObject']]], + ['positive_5fpwm_5fscales_463',['positive_pwm_scales',['../namespacerobot.html#abf2d3136c13712a212ebf41ed4a6ff58',1,'robot']]], + ['positive_5fsign_464',['positive_sign',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a3c7d2522e2dc2a5fa2634a1a18b873c4',1,'std::moneypunct::positive_sign()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a3c7d2522e2dc2a5fa2634a1a18b873c4',1,'std::moneypunct_byname::positive_sign()']]], + ['post_20filtering_465',['Disparity map post-filtering',['https://docs.opencv.org/4.2.0/d3/d14/tutorial_ximgproc_disparity_filtering.html',1,'']]], + ['postprocess_466',['postprocess',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a90788819ae75ed8cc94331159859d133',1,'cv::detail']]], + ['postprocess_5focl_467',['postprocess_ocl',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a8c6a7120c4c06f085a6bc3503243c4d9',1,'cv::detail']]], + ['postprocessframe_468',['postProcessFrame',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#a9f5989a3c55cc05e11b15a720cfb96cd',1,'cv::videostab::OnePassStabilizer::postProcessFrame()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aeaeea250e70f8618e72a2f4fe8224398',1,'cv::videostab::StabilizerBase::postProcessFrame()'],['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a2dd1f28556984f5a955224a377ba3cb5',1,'cv::videostab::TwoPassStabilizer::postProcessFrame()']]], + ['postypes_2eh_469',['postypes.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00443.html',1,'']]], + ['potparams_5ft_470',['potparams_t',['../structrobot_1_1potparams__t.html',1,'robot']]], + ['pow_471',['pow',['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#acb769e1ab1d809abb77c7ab98021ad81',1,'Eigen::ArrayBase::pow(const Eigen::ArrayBase< Derived > &x, const Eigen::ArrayBase< ExponentDerived > &exponents)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a5df3d99d47747b72d61f235c9fb925e3',1,'Eigen::ArrayBase::pow(const Eigen::ArrayBase< Derived > &x, const ScalarExponent &exponent)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#acb7a6224d50620991d1fb9888b8be6e6',1,'Eigen::ArrayBase::pow(const Scalar &x, const Eigen::ArrayBase< Derived > &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#acb769e1ab1d809abb77c7ab98021ad81',1,'ArrayBase< ArrayWrapper< ExpressionType > >::pow(const Eigen::ArrayBase< ArrayWrapper< ExpressionType > > &x, const Eigen::ArrayBase< ExponentDerived > &exponents)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a5df3d99d47747b72d61f235c9fb925e3',1,'ArrayBase< ArrayWrapper< ExpressionType > >::pow(const Eigen::ArrayBase< ArrayWrapper< ExpressionType > > &x, const ScalarExponent &exponent)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#acb7a6224d50620991d1fb9888b8be6e6',1,'ArrayBase< ArrayWrapper< ExpressionType > >::pow(const Scalar &x, const Eigen::ArrayBase< ArrayWrapper< ExpressionType > > &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ae6c25e6a94a60e147741e76203a73b',1,'Eigen::MatrixBase::pow(const RealScalar &p) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a91dcacf224bd8b18346914bdf7eefc31',1,'Eigen::MatrixBase::pow(const std::complex< RealScalar > &p) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ae6c25e6a94a60e147741e76203a73b',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::pow(const RealScalar &p) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a91dcacf224bd8b18346914bdf7eefc31',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::pow(const std::complex< RealScalar > &p) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ae6c25e6a94a60e147741e76203a73b',1,'MatrixBase< Solve< Decomposition, RhsType > >::pow(const RealScalar &p) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a91dcacf224bd8b18346914bdf7eefc31',1,'MatrixBase< Solve< Decomposition, RhsType > >::pow(const std::complex< RealScalar > &p) const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga8bc36646a43b82baa15f151a973fb0c5',1,'cv::pow(const softfloat &a, const softfloat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaa02f6b3f5671b691159973a056e57980',1,'cv::pow(const softdouble &a, const softdouble &b)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf0d056b5bd1dc92500d6f6cf6bac41ef',1,'cv::pow(InputArray src, double power, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga82d04ef4bcc4dfa9bfbe76488007c6c4',1,'cv::cuda::pow()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf0d056b5bd1dc92500d6f6cf6bac41ef',1,'pow(InputArray src, double power, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga8bc36646a43b82baa15f151a973fb0c5',1,'pow(const softfloat &a, const softfloat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaa02f6b3f5671b691159973a056e57980',1,'pow(const softdouble &a, const softdouble &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga82d04ef4bcc4dfa9bfbe76488007c6c4',1,'pow(InputArray src, double power, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaacf8017e100d619acab131da8a4017e1',1,'std::pow(const complex< _Tp > &, int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga6e1161f2920c46a042888c60e9d8447c',1,'std::pow(const complex< _Tp > &, const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gad07a5f0000890bb20d170700575d210c',1,'std::pow(const complex< _Tp > &, const complex< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gadb1a322e1cc55220dc7ff754815ffbc7',1,'std::pow(const _Tp &, const complex< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaab6ff7d7d6909209885edbc25b74a930',1,'std::tr1::pow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaacf8017e100d619acab131da8a4017e1',1,'pow(const complex< _Tp > &, int)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga6e1161f2920c46a042888c60e9d8447c',1,'pow(const complex< _Tp > &, const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gad07a5f0000890bb20d170700575d210c',1,'pow(const complex< _Tp > &, const complex< _Tp > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gadb1a322e1cc55220dc7ff754815ffbc7',1,'pow(const _Tp &, const complex< _Tp > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaab6ff7d7d6909209885edbc25b74a930',1,'pow(const std::complex< _Tp > &__x, const _Up &__y)(Global Namespace)']]], + ['pow_5f_472',['pow_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa69bd5c46cef6040c304293356b69151',1,'cv::cudev::pow_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa69bd5c46cef6040c304293356b69151',1,'pow_()(Global Namespace)']]], + ['pow_5ffunc_473',['pow_func',['https://docs.opencv.org/4.2.0/da/dda/structcv_1_1cudev_1_1pow__func.html',1,'cv::cudev']]], + ['pow_5ffunc_3c_20double_20_3e_474',['pow_func< double >',['https://docs.opencv.org/4.2.0/d2/deb/structcv_1_1cudev_1_1pow__func_3_01double_01_4.html',1,'cv::cudev']]], + ['power_475',['power',['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1dnn_1_1PowerLayer.html#a4601f5017ef110040e09ece8307a2888',1,'cv::dnn::PowerLayer::power'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga52a0d4d0aad4e35cbcc82c8be1dfcebe',1,'__gnu_cxx::power(_Tp __x, _Integer __n, _MonoidOperation __monoid_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga2a1a321e469c0cafa50d1085b27ebbc3',1,'__gnu_cxx::power(_Tp __x, _Integer __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga52a0d4d0aad4e35cbcc82c8be1dfcebe',1,'power(_Tp __x, _Integer __n, _MonoidOperation __monoid_op)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga2a1a321e469c0cafa50d1085b27ebbc3',1,'power(_Tp __x, _Integer __n)(Global Namespace)']]], + ['powerlayer_476',['PowerLayer',['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1dnn_1_1PowerLayer.html',1,'cv::dnn']]], + ['powerrepeattask_477',['PowerRepeatTask',['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html',1,'net::mc::tasks']]], + ['ppbuffers_478',['ppBuffers',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#ac3a1af68ad97248705ef457596e00f64',1,'NppStInterpolationState']]], + ['ppf_479',['ppf',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a104f79f2f9f2d9b4e6b7f9c1c107f395',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['ppf3ddetector_480',['PPF3DDetector',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html',1,'cv::ppf_match_3d::PPF3DDetector'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#abe2433c0b4eb9be6506172aeccdd534e',1,'cv::ppf_match_3d::PPF3DDetector::PPF3DDetector()'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a10173afac3cb9d9fe99e11e0d4d56f81',1,'cv::ppf_match_3d::PPF3DDetector::PPF3DDetector(const double relativeSamplingStep, const double relativeDistanceStep=0.05, const double numAngles=30)']]], + ['ppf_5fhelpers_2ehpp_481',['ppf_helpers.hpp',['https://docs.opencv.org/4.2.0/d9/dd2/ppf__helpers_8hpp.html',1,'']]], + ['ppf_5fmatch_5f3d_2ehpp_482',['ppf_match_3d.hpp',['https://docs.opencv.org/4.2.0/d5/d52/ppf__match__3d_8hpp.html',1,'']]], + ['ppfind_483',['ppfInd',['https://docs.opencv.org/4.2.0/da/dff/structTHash.html#ab8659b1eb899d80a03739b7462419bf0',1,'THash']]], + ['ppjr_484',['ppjr',['../structrobot_1_1encparams__t.html#a569ee2230808fa6c878923f174515a23',1,'robot::encparams_t']]], + ['pptr_485',['pptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'__gnu_cxx::enc_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'__gnu_cxx::enc_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'__gnu_cxx::stdio_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'__gnu_cxx::stdio_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'__gnu_cxx::stdio_sync_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'__gnu_cxx::stdio_sync_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_filebuf< char_type, traits_type >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_filebuf< char_type, traits_type >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_streambuf< _Elem, _Tr >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_streambuf< _Elem, _Tr >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_streambuf< char, _Traits >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_streambuf< char, _Traits >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_streambuf< char, char_traits< char > >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'basic_streambuf< char, char_traits< char > >::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::basic_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::basic_filebuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::basic_streambuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::basic_streambuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::basic_stringbuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::basic_stringbuf::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::wbuffer_convert::pptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af485f3989ebaf74cbfc5f8f578f2e63d',1,'std::wbuffer_convert::pptr() const']]], + ['ppx_486',['ppx',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#ad2ee5acb3760aa3e94c2cf711ad127e9',1,'cv::detail::CameraParams']]], + ['ppy_487',['ppy',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#a3a896fe0f6a7851c449eaf063af94d49',1,'cv::detail::CameraParams']]], + ['practices_488',['Best Practices',['../md_StyleGuide.html#autotoc_md3',1,'']]], + ['precision_489',['precision',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'basic_ios< char, _Traits >::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'basic_ios< char, _Traits >::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'basic_iostream< char >::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'basic_iostream< char >::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'basic_istream< char >::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'basic_istream< char >::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'basic_istream< char, _Traits >::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'basic_istream< char, _Traits >::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'basic_ostream< char >::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'basic_ostream< char >::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'basic_ostream< char, _Traits >::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'basic_ostream< char, _Traits >::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_fstream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_fstream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_ifstream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_ifstream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_ios::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_ios::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_iostream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_iostream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_istream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_istream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_istringstream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_istringstream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_ofstream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_ofstream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_ostream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_ostream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_ostringstream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_ostringstream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::basic_stringstream::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::basic_stringstream::precision(streamsize __prec)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a22f2e1638f5fcac7fff2442122dc51e6',1,'std::ios_base::precision() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae76be155a419e7056ece84ad7dbd8ec7',1,'std::ios_base::precision(streamsize __prec)']]], + ['preconditioner_490',['preconditioner',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a5e88f2a323a2900205cf807af94f8051',1,'Eigen::IterativeSolverBase::preconditioner()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a709a056e17c49b5272e4971bc376cbe4',1,'Eigen::IterativeSolverBase::preconditioner() const']]], + ['preconditionerfrompoints_491',['preconditionerFromPoints',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga85b7dbb7aebde1e970ec1c034edfd19c',1,'cv::sfm::preconditionerFromPoints()'],['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga85b7dbb7aebde1e970ec1c034edfd19c',1,'preconditionerFromPoints()(Global Namespace)']]], + ['precornerdetect_492',['preCornerDetect',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gaa819f39b5c994871774081803ae22586',1,'cv::preCornerDetect()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gaa819f39b5c994871774081803ae22586',1,'preCornerDetect()(Global Namespace)']]], + ['pred_493',['pred',['https://docs.opencv.org/4.2.0/d1/d81/structcv_1_1cudev_1_1BinaryNegate.html#addec158325891027e595ca01b96ea064',1,'cv::cudev::BinaryNegate::pred'],['https://docs.opencv.org/4.2.0/d2/d83/structcv_1_1cudev_1_1UnaryNegate.html#a870d0d91c7c71abfc7759b6046ab8967',1,'cv::cudev::UnaryNegate::pred']]], + ['predefined_5fdictionary_5fname_494',['PREDEFINED_DICTIONARY_NAME',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gac84398a9ed9dd01306592dd616c2c975',1,'cv::aruco::PREDEFINED_DICTIONARY_NAME'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gac84398a9ed9dd01306592dd616c2c975',1,'PREDEFINED_DICTIONARY_NAME(Global Namespace)']]], + ['predefined_5fops_2eh_495',['predefined_ops.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00446.html',1,'']]], + ['predict_496',['predict',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a246319d4d89c7dd58bac54a27d9378f8',1,'cv::tbm::TrackerParams::predict'],['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ae3f12147ba846a53601b60c784ee263d',1,'cv::ml::EM::predict()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#aa2d2f02faffab1bf01317ae6502fb631',1,'cv::face::FaceRecognizer::predict(InputArray src) const'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#ab0d593e53ebd9a0f350c989fcac7f251',1,'cv::face::FaceRecognizer::predict(InputArray src, int &label, double &confidence) const'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#afc5af8e603b525e9cdc6b3ddcd7cf83f',1,'cv::face::FaceRecognizer::predict(InputArray src, Ptr< PredictCollector > collector) const=0'],['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#aa710d2255566bec8d6ce608d103d4fa7',1,'cv::KalmanFilter::predict()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a2fca689e7cc1046c6ac459611be0f0f2',1,'cv::ml::LogisticRegression::predict()'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a6d39f78e25182db6d6f66b2312ca37e6',1,'cv::dnn::Model::predict()'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#a1a7e49e1febd10392452727498771bc1',1,'cv::ml::StatModel::predict()'],['https://docs.opencv.org/4.2.0/de/d72/classcv_1_1tracking_1_1UnscentedKalmanFilter.html#aa01ae27428459e61b6a260f44af97c95',1,'cv::tracking::UnscentedKalmanFilter::predict()'],['../classfilters_1_1ExtendedKalmanFilter.html#a9c84b7fe3c850719718405399e329899',1,'filters::ExtendedKalmanFilter::predict()'],['../classfilters_1_1KalmanFilter.html#aff9450b925ea5c8128079dc4c21ff0be',1,'filters::KalmanFilter::predict()'],['../classfilters_1_1KalmanFilterBase.html#ad37fc23432aa56b8a87f2aa1aa42ca0c',1,'filters::KalmanFilterBase::predict()']]], + ['predict2_497',['predict2',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a2ea7da92a75bc7a7d665c241f547b9b9',1,'cv::ml::EM']]], + ['predict_5fauto_498',['PREDICT_AUTO',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a7afa5cd2289fb88989c0ab1b8b5d8ac2af0192db97208b67118f642530da47332',1,'cv::ml::DTrees']]], + ['predict_5fcollector_2ehpp_499',['predict_collector.hpp',['https://docs.opencv.org/4.2.0/d9/d98/predict__collector_8hpp.html',1,'']]], + ['predict_5fmask_500',['PREDICT_MASK',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a7afa5cd2289fb88989c0ab1b8b5d8ac2a59a0cd54206e4092bc2bff1ce50c8afa',1,'cv::ml::DTrees']]], + ['predict_5fmax_5fvote_501',['PREDICT_MAX_VOTE',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a7afa5cd2289fb88989c0ab1b8b5d8ac2ad753bae4672b471203e418d820c00e85',1,'cv::ml::DTrees']]], + ['predict_5fsum_502',['PREDICT_SUM',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a7afa5cd2289fb88989c0ab1b8b5d8ac2a1d3f6687120ea6b337f6a91234529a13',1,'cv::ml::DTrees']]], + ['predictcollector_503',['PredictCollector',['https://docs.opencv.org/4.2.0/da/d6a/classcv_1_1face_1_1PredictCollector.html',1,'cv::face']]], + ['predicted_5frect_504',['predicted_rect',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#ae30489e04af4f73ce5241a5989e539e7',1,'cv::tbm::Track']]], + ['prediction_2emarkdown_505',['prediction.markdown',['https://docs.opencv.org/4.2.0/dd/df3/prediction_8markdown.html',1,'']]], + ['predictoptimalvectorwidth_506',['predictOptimalVectorWidth',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga1b16507915166d63529ad8126e465c1a',1,'cv::ocl::predictOptimalVectorWidth()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga1b16507915166d63529ad8126e465c1a',1,'predictOptimalVectorWidth()(Global Namespace)']]], + ['predictoptimalvectorwidthmax_507',['predictOptimalVectorWidthMax',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga8b96cd547eac1e787cf50e22820bc4b9',1,'cv::ocl::predictOptimalVectorWidthMax()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga8b96cd547eac1e787cf50e22820bc4b9',1,'predictOptimalVectorWidthMax()(Global Namespace)']]], + ['predictprob_508',['predictProb',['https://docs.opencv.org/4.2.0/d4/d8e/classcv_1_1ml_1_1NormalBayesClassifier.html#a146e961a610d26f3c3c3b85da5406e08',1,'cv::ml::NormalBayesClassifier']]], + ['predictresult_509',['PredictResult',['https://docs.opencv.org/4.2.0/d2/d5a/structcv_1_1face_1_1StandardCollector_1_1PredictResult.html',1,'cv::face::StandardCollector::PredictResult'],['https://docs.opencv.org/4.2.0/d2/d5a/structcv_1_1face_1_1StandardCollector_1_1PredictResult.html#a5610c5f6064c63d0d984c109a962b9e4',1,'cv::face::StandardCollector::PredictResult::PredictResult()']]], + ['preferabletarget_510',['preferableTarget',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a35e0e4f0e8441d1b0e62c596df6b1942',1,'cv::dnn::Layer']]], + ['preferedworkgroupsizemultiple_511',['preferedWorkGroupSizeMultiple',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a4c7c188799b17f593647f3476de0ec4f',1,'cv::ocl::Kernel']]], + ['preferredvectorwidthchar_512',['preferredVectorWidthChar',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a8de7518d696d8bca07cf792422b47be4',1,'cv::ocl::Device']]], + ['preferredvectorwidthdouble_513',['preferredVectorWidthDouble',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2c0ca2b983966a2aeff861b7d6fd4480',1,'cv::ocl::Device']]], + ['preferredvectorwidthfloat_514',['preferredVectorWidthFloat',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a588b64852f17bcb7cd120507d4f6e0f4',1,'cv::ocl::Device']]], + ['preferredvectorwidthhalf_515',['preferredVectorWidthHalf',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0c8276f354defd3286fa7c714cd32950',1,'cv::ocl::Device']]], + ['preferredvectorwidthint_516',['preferredVectorWidthInt',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a27db2c75d80aab51898646c8cd196f3b',1,'cv::ocl::Device']]], + ['preferredvectorwidthlong_517',['preferredVectorWidthLong',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ad572c1f0616eff7b7f4ef619fe4db95a',1,'cv::ocl::Device']]], + ['preferredvectorwidthshort_518',['preferredVectorWidthShort',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a48fad69242e5a910149f2a8145a4046c',1,'cv::ocl::Device']]], + ['preferredvelpreservation_519',['PreferredVelPreservation',['../classkinematics_1_1DiffDriveKinematics.html#a86eec2022910a71e36af970c0995c4ba',1,'kinematics::DiffDriveKinematics']]], + ['prefilter_5fnormalized_5fresponse_520',['PREFILTER_NORMALIZED_RESPONSE',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a132c8592df90dfeb4564f173906098c3a4f085923f5d5fe24ca626d92786badbc',1,'cv::stereo::StereoBinaryBM::PREFILTER_NORMALIZED_RESPONSE'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#aa186af0c0db79e9a53e232824c40e363a9b5f32162b35799e3c29e1bfd73e93df',1,'cv::StereoBM::PREFILTER_NORMALIZED_RESPONSE']]], + ['prefilter_5fxsobel_521',['PREFILTER_XSOBEL',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a132c8592df90dfeb4564f173906098c3a2363d746ab876d6be236d61c6377bdca',1,'cv::stereo::StereoBinaryBM::PREFILTER_XSOBEL'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#aa186af0c0db79e9a53e232824c40e363abf381e03e290b2b94541738193a6abd6',1,'cv::StereoBM::PREFILTER_XSOBEL']]], + ['prefix_522',['prefix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4f1ab979440a0c53c13422a5d628144e',1,'match_results< _Bi_iter >::prefix() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4f1ab979440a0c53c13422a5d628144e',1,'match_results< _Bi_iter >::prefix() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4f1ab979440a0c53c13422a5d628144e',1,'std::match_results::prefix()']]], + ['prefix_5frange_523',['prefix_range',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#ac07e23033a7082e95a059e56227a5a79',1,'__gnu_pbds::trie_prefix_search_node_update::prefix_range(key_const_reference) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#a0a5588142f380274ac33c5a243b394d1',1,'__gnu_pbds::trie_prefix_search_node_update::prefix_range(key_const_reference)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#a5c3ff0a8d56d0d771d3391ae1d0de06e',1,'__gnu_pbds::trie_prefix_search_node_update::prefix_range(a_const_iterator, a_const_iterator) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#af29b3894ff0f8fad9217cdcde5e5af1f',1,'__gnu_pbds::trie_prefix_search_node_update::prefix_range(a_const_iterator, a_const_iterator)']]], + ['prefix_5fsearch_5fnode_5fupdate_5fimp_2ehpp_524',['prefix_search_node_update_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01445.html',1,'']]], + ['prep_525',['prep',['https://docs.opencv.org/4.2.0/dd/d1c/classcv_1_1gapi_1_1wip_1_1GCaptureSource.html#a609ad8dfcb829ed321a48bc9392444cd',1,'cv::gapi::wip::GCaptureSource']]], + ['prepare_526',['prepare',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#aeb4e38fed207e6da858cb7f64ae95dbc',1,'cv::detail::Blender::prepare(const std::vector< Point > &corners, const std::vector< Size > &sizes)'],['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#a6d81cd6a0a2284de3ec7898409c7c0a8',1,'cv::detail::Blender::prepare(Rect dst_roi)'],['https://docs.opencv.org/4.2.0/d4/d69/classcv_1_1detail_1_1FeatherBlender.html#a086623ff68da90071aca0fa79ebeaac0',1,'cv::detail::FeatherBlender::prepare()'],['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html#ac108b634893bbbae59ac3a3562fed070',1,'cv::detail::MultiBandBlender::prepare()']]], + ['prepareframecache_527',['prepareFrameCache',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a578c1849dbc9df24d80ffc28fda6f9c8',1,'cv::rgbd::FastICPOdometry::prepareFrameCache()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a651fe7eab423d79d258c8f26d12601a0',1,'cv::rgbd::ICPOdometry::prepareFrameCache()'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a894cc56de5ecc916d19a7984c6f307a8',1,'cv::rgbd::Odometry::prepareFrameCache()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#af1568ca5cfe8f3f1ac2fc43f8d566f7a',1,'cv::rgbd::RgbdICPOdometry::prepareFrameCache()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a69a299421caa7871356c8931ef64b3ee',1,'cv::rgbd::RgbdOdometry::prepareFrameCache()']]], + ['preprocessed_5finput_528',['PREPROCESSED_INPUT',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af1ea864e1c19796e6264ebb3950c0b9aa0cdfa2b3b9c5947d9a80bcca7eac485f',1,'cv::ml::StatModel']]], + ['preprocessedframe_5f_529',['preProcessedFrame_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#acffea61e04a38c512e09a643ae2c8d13',1,'cv::videostab::StabilizerBase']]], + ['preprocessor_20directives_530',['Preprocessor directives',['https://eigen.tuxfamily.org/dox/TopicPreprocessorDirectives.html',1,'']]], + ['prerotate_531',['prerotate',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ac5d65c2387e8d8b8f1526fc2c8443661',1,'Eigen::Transform']]], + ['prescale_532',['prescale',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a0d87009c9449d1920c037eb58468e757',1,'Eigen::Transform::prescale(const MatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a96c5e49e1d779299f4975dfef93e14b3',1,'Eigen::Transform::prescale(const Scalar &s)']]], + ['preserving_20decolorization_533',['Contrast Preserving Decolorization',['https://docs.opencv.org/4.2.0/d4/d32/group__photo__decolor.html',1,'']]], + ['preset_5ffast_534',['PRESET_FAST',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a6c7cf2e6b3c9cf450a1f73185bed1300acac18d130d259ee7dcdd6a874508b047',1,'cv::DISOpticalFlow']]], + ['preset_5fmedium_535',['PRESET_MEDIUM',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a6c7cf2e6b3c9cf450a1f73185bed1300a2ed2f21190ccc2e47a480615407d61aa',1,'cv::DISOpticalFlow']]], + ['preset_5fultrafast_536',['PRESET_ULTRAFAST',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a6c7cf2e6b3c9cf450a1f73185bed1300a9f90dcf9da43619e3c401f0c0956f998',1,'cv::DISOpticalFlow']]], + ['presets_537',['Presets',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#aea50d9f35bb932de907f5b83defc4151',1,'cv::cudacodec::EncoderParams']]], + ['preshear_538',['preshear',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a17c40209cfd2d094cf654504aca95bf1',1,'Eigen::Transform']]], + ['pretranslate_539',['pretranslate',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ae9be55c2f6f4d56b0878c983c0ff9cc6',1,'Eigen::Transform']]], + ['prev_540',['prev',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a028cc98d3aaca0dbbbbc3434572cce57',1,'cv::text::ERStat']]], + ['prev_5faround_5fdst_541',['PREV_AROUND_DST',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa35f844eeaa2817613fe40d436bc59e4a2256b56cf701d279a673dca2de0f1f96',1,'cv::Subdiv2D']]], + ['prev_5faround_5fleft_542',['PREV_AROUND_LEFT',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa35f844eeaa2817613fe40d436bc59e4acd1befba98e8c2956602923ac2e32f8f',1,'cv::Subdiv2D']]], + ['prev_5faround_5forg_543',['PREV_AROUND_ORG',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa35f844eeaa2817613fe40d436bc59e4a8170778bb0286aa463cae5232446008f',1,'cv::Subdiv2D']]], + ['prev_5faround_5fright_544',['PREV_AROUND_RIGHT',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa35f844eeaa2817613fe40d436bc59e4ae1d0ccf41e7cc6eadb9a26925fc25b18',1,'cv::Subdiv2D']]], + ['prev_5fpermutation_545',['prev_permutation',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga0b0e35a43f5f87ea1c66363be3a34619',1,'std::prev_permutation(_BidirectionalIterator __first, _BidirectionalIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga44e9b1d39001f68fa9fcb408b25a77f0',1,'std::prev_permutation(_BidirectionalIterator __first, _BidirectionalIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga0b0e35a43f5f87ea1c66363be3a34619',1,'prev_permutation(_BidirectionalIterator __first, _BidirectionalIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga44e9b1d39001f68fa9fcb408b25a77f0',1,'prev_permutation(_BidirectionalIterator __first, _BidirectionalIterator __last, _Compare __comp)(Global Namespace)']]], + ['prevallocator_546',['prevAllocator',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#aaefdaa34b364c74fa54c72da4a218384',1,'cv::UMatData']]], + ['preview_20based_20cv_20application_547',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], + ['prim_548',['Prim',['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html#ga990eafe0a1928eee6346bf863a21dc40',1,'cv::gapi::wip::draw::Prim'],['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html#ga990eafe0a1928eee6346bf863a21dc40',1,'Prim(Global Namespace)']]], + ['primitives_549',['Drawing primitives',['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html',1,'']]], + ['prims_550',['Prims',['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html#ga97ddfd7fca32bf5c1db56f25ab7d2b7e',1,'cv::gapi::wip::draw::Prims'],['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html#ga97ddfd7fca32bf5c1db56f25ab7d2b7e',1,'Prims(Global Namespace)']]], + ['principal_20component_20analysis_20pca_551',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], + ['principal_5fpoint_5fx_552',['principal_point_x',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#aebf2bea45d0b050c8517177aff3bbb6e',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['principal_5fpoint_5fy_553',['principal_point_y',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a4eb89feb3d0555da1931a4cf3fe79e04',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['print_554',['print',['https://docs.opencv.org/4.2.0/d8/d95/classcv_1_1videostab_1_1ILog.html#a86f2e9eee64228bfee3934337231c53e',1,'cv::videostab::ILog::print()'],['https://docs.opencv.org/4.2.0/d5/de0/classcv_1_1videostab_1_1LogToStdout.html#a4b76af16d16ab03db21deedcaf400358',1,'cv::videostab::LogToStdout::print()'],['https://docs.opencv.org/4.2.0/d6/d78/classcv_1_1videostab_1_1NullLog.html#a0c5e437e1b76d3af8630a24cf96163e9',1,'cv::videostab::NullLog::print()'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a701210a0203f2786cbfd04b2bd56da47',1,'cv::dnn::print()']]], + ['printattrs_555',['printAttrs',['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#a61186b9d6bf3e50a2643f5f95d9d01a2',1,'cv::CvHaarFeatureParams::printAttrs()'],['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html#a4f781c4db30a0816adcb3347c12fbec8',1,'cv::CvParams::printAttrs()']]], + ['printcudadeviceinfo_556',['printCudaDeviceInfo',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gaa37afdfb8efe85b6252ca2bb8bea8ff2',1,'cv::cuda::printCudaDeviceInfo()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gaa37afdfb8efe85b6252ca2bb8bea8ff2',1,'printCudaDeviceInfo()(Global Namespace)']]], + ['printdefaults_557',['printDefaults',['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#a456fc170d14e5a35c32d90b1cbf05552',1,'cv::CvHaarFeatureParams::printDefaults()'],['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html#a947f3edd9ebd435049ea64ad6719c3b0',1,'cv::CvParams::printDefaults()']]], + ['printerror_558',['printError',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#acdaf7dab7420e99efae1cc37cc9b399d',1,'cv::AVIReadContainer::printError(RiffList &list, unsigned int expected_fourcc)'],['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a9306c56efc696b968a931f7d3d266215',1,'cv::AVIReadContainer::printError(RiffChunk &chunk, unsigned int expected_fourcc)']]], + ['printerrors_559',['printErrors',['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#a70c31969ec5259b8c093d11a80c34f9f',1,'cv::CommandLineParser']]], + ['printfbuffersize_560',['printfBufferSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#abc5ce3dfc96d700aa85a908207fe948e',1,'cv::ocl::Device']]], + ['printmessage_561',['printMessage',['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#a84cda3794b765332bfe43bf8367222fb',1,'cv::CommandLineParser']]], + ['printpose_562',['printPose',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#aafb846e4bf0a2943ee751c59342ad630',1,'cv::ppf_match_3d::Pose3D']]], + ['printprogress_563',['printProgress',['https://docs.opencv.org/4.2.0/d1/dcc/structcv_1_1optflow_1_1GPCTrainingParams.html#a2c5256bc7c99e0ca2fd998cf129f5e8c',1,'cv::optflow::GPCTrainingParams']]], + ['printsetup_564',['printSetup',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a80d39a3463c206425e16ce85caa78d03',1,'cv::bioinspired::Retina::printSetup()'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#a064f6f85ff155551d545af64e8bcd05f',1,'cv::bioinspired::TransientAreasSegmentationModule::printSetup()']]], + ['printshortcudadeviceinfo_565',['printShortCudaDeviceInfo',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gacece2dc1d7962bcc7233c033fe64328b',1,'cv::cuda::printShortCudaDeviceInfo()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gacece2dc1d7962bcc7233c033fe64328b',1,'printShortCudaDeviceInfo()(Global Namespace)']]], + ['printumfpackcontrol_566',['printUmfpackControl',['https://eigen.tuxfamily.org/dox/classEigen_1_1UmfPackLU.html#a1e3543c0e6ae499e3d25f5a8a8f50623',1,'Eigen::UmfPackLU']]], + ['printumfpackinfo_567',['printUmfpackInfo',['https://eigen.tuxfamily.org/dox/classEigen_1_1UmfPackLU.html#a9b42dd0135fc9bcffec37f043022f135',1,'Eigen::UmfPackLU']]], + ['printumfpackstatus_568',['printUmfpackStatus',['https://eigen.tuxfamily.org/dox/classEigen_1_1UmfPackLU.html#aea06a54a1e4e8fc1ec522103825cc7b6',1,'Eigen::UmfPackLU']]], + ['prior_569',['prior',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#ac7c0cb49e5c7117bbde9243459670f12',1,'cv::optflow::OpticalFlowPCAFlow']]], + ['priorboxlayer_570',['PriorBoxLayer',['https://docs.opencv.org/4.2.0/da/d1e/classcv_1_1dnn_1_1PriorBoxLayer.html',1,'cv::dnn']]], + ['priority_5fqueue_571',['priority_queue',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11187.html',1,'__gnu_pbds::priority_queue< class, class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html',1,'std::priority_queue< _Tp, _Sequence, _Compare >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01534.html#gaa6332f0e852dc89f0879cb5408d168c0',1,'__gnu_pbds::priority_queue::priority_queue(const cmp_fn &r_cmp_fn)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01534.html#ga2b637d89cbd874881a4da920d57b0487',1,'__gnu_pbds::priority_queue::priority_queue(It first_it, It last_it)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01534.html#gad0141192206747833a170be548fd51e0',1,'__gnu_pbds::priority_queue::priority_queue(It first_it, It last_it, const cmp_fn &r_cmp_fn)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#ad9ef96e9ae20769410ce372f0f7c4f42',1,'std::priority_queue::priority_queue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#a83695f69303684e73b764c27d2da64d4',1,'std::priority_queue::priority_queue(_InputIterator __first, _InputIterator __last, const _Compare &__x, const _Sequence &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01534.html#gaa6332f0e852dc89f0879cb5408d168c0',1,'priority_queue(const cmp_fn &r_cmp_fn)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01534.html#ga2b637d89cbd874881a4da920d57b0487',1,'priority_queue(It first_it, It last_it)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01534.html#gad0141192206747833a170be548fd51e0',1,'priority_queue(It first_it, It last_it, const cmp_fn &r_cmp_fn)(Global Namespace)']]], + ['priority_5fqueue_2ehpp_572',['priority_queue.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01127.html',1,'']]], + ['priority_5fqueue_3c_20schedule_5ft_2c_20std_3a_3avector_3c_20schedule_5ft_20_3e_2c_20std_3a_3agreater_3c_20schedule_5ft_20_3e_20_3e_573',['priority_queue< schedule_t, std::vector< schedule_t >, std::greater< schedule_t > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html',1,'std']]], + ['priority_5fqueue_5fbase_5fdispatch_2ehpp_574',['priority_queue_base_dispatch.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01148.html',1,'']]], + ['priority_5fqueue_5ftag_575',['priority_queue_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11267.html',1,'__gnu_pbds']]], + ['priv_576',['priv',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#adbe25a8d4e35c2ed89fb53bd1f011200',1,'cv::gapi::fluid::Buffer::priv()'],['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#ac7d9575f460f9a1ada47f7118d317c94',1,'cv::gapi::fluid::Buffer::priv() const'],['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#a3bc9b0e7d2624b3b6c79e5598b31d369',1,'cv::detail::GArrayU::priv()'],['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#aa5ac43b89618d0378a0df9e34f24be31',1,'cv::detail::GArrayU::priv() const'],['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html#a52b60c5d248f265bf3a5295357ce48d2',1,'cv::gapi::GBackend::priv()'],['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html#a12fba7e51db326d0f58ea4503979db63',1,'cv::gapi::GBackend::priv() const'],['https://docs.opencv.org/4.2.0/dc/d02/classcv_1_1GCall.html#a19f861f39b3c6fbbc00cf9be165bfad1',1,'cv::GCall::priv()'],['https://docs.opencv.org/4.2.0/dc/d02/classcv_1_1GCall.html#a8fa2afa061d88a5cd0ce1548c2b7d1b0',1,'cv::GCall::priv() const'],['https://docs.opencv.org/4.2.0/df/daa/classcv_1_1GMat.html#aa1c3bc5e0f079e441ee625185fefa50c',1,'cv::GMat::priv()'],['https://docs.opencv.org/4.2.0/df/daa/classcv_1_1GMat.html#a8e8ece216852023d524729aa1112d86f',1,'cv::GMat::priv() const'],['https://docs.opencv.org/4.2.0/d9/d98/classcv_1_1GScalar.html#a5da63d5a7d3a0ccf01668cc7f57afd55',1,'cv::GScalar::priv()'],['https://docs.opencv.org/4.2.0/d9/d98/classcv_1_1GScalar.html#ab09d37dc122b93d0f197e23615d94372',1,'cv::GScalar::priv() const'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#a80658215aafc60ffa2ae6e8e2b3c804b',1,'cv::gapi::fluid::View::priv()'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#a395c7ec98ee8d58d5cee2ba3c2f6ad19',1,'cv::gapi::fluid::View::priv() const']]], + ['private_20implementation_20helpers_577',['Private implementation helpers',['https://docs.opencv.org/4.2.0/dd/d96/group__core__hal__intrin__impl.html',1,'']]], + ['private_2ecuda_2ehpp_578',['private.cuda.hpp',['https://docs.opencv.org/4.2.0/dc/d7a/private_8cuda_8hpp.html',1,'']]], + ['private_2ehpp_579',['private.hpp',['https://docs.opencv.org/4.2.0/d4/db2/modules_2core_2include_2opencv2_2core_2private_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d3c/contrib_2modules_2cudalegacy_2include_2opencv2_2cudalegacy_2private_8hpp.html',1,'(Global Namespace)']]], + ['prob_580',['prob',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#aa43b08b4dfbc551b19f1217f8c67f5ca',1,'cv::videostab::RansacParams']]], + ['probabilities_581',['probabilities',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a61e7fb7df1787577f1b0a94f07e3c1e3',1,'std::discrete_distribution']]], + ['probability_582',['probability',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a5134258df86ded2fbbcc1bb4b64e325c',1,'cv::text::ERStat']]], + ['probe_5ffn_5fbase_583',['probe_fn_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11743.html',1,'__gnu_pbds::detail']]], + ['probe_5ffn_5fbase_2ehpp_584',['probe_fn_base.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01325.html',1,'']]], + ['problems_20and_20decompositions_585',['Dense linear problems and decompositions',['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'']]], + ['process_586',['process',['https://docs.opencv.org/4.2.0/d4/df2/classcv_1_1AlignExposures.html#aa2379b2fb9629d779b6a54ad1cabfc1c',1,'cv::AlignExposures::process()'],['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a5f565da5f84500aa5915906a2698ecfe',1,'cv::AlignMTB::process(InputArrayOfArrays src, std::vector< Mat > &dst, InputArray times, InputArray response) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a37b3417d844f362d781f34155cbcb201',1,'cv::AlignMTB::process(InputArrayOfArrays src, std::vector< Mat > &dst)=0'],['https://docs.opencv.org/4.2.0/dd/de3/classcv_1_1CalibrateCRF.html#a7bd220808762094e0b48819f63437196',1,'cv::CalibrateCRF::process()'],['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a04010a77df58e838a781889eb4edd303',1,'cv::DetectionBasedTracker::process()'],['https://docs.opencv.org/4.2.0/d9/dbb/classcv_1_1videostab_1_1IOutlierRejector.html#a7d49112305864ffad1e47cc5057c2e89',1,'cv::videostab::IOutlierRejector::process()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a5a0202bf2ac201d5bbfcac2a48a926dd',1,'cv::tbm::ITrackerByMatching::process()'],['https://docs.opencv.org/4.2.0/df/d62/classcv_1_1MergeDebevec.html#adf18c10c2edf68b6a8141eb972b2e860',1,'cv::MergeDebevec::process(InputArrayOfArrays src, OutputArray dst, InputArray times, InputArray response) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/df/d62/classcv_1_1MergeDebevec.html#aca5d520352e06b99754c1b5a6d88b58d',1,'cv::MergeDebevec::process(InputArrayOfArrays src, OutputArray dst, InputArray times)=0'],['https://docs.opencv.org/4.2.0/d6/d5e/classcv_1_1MergeExposures.html#a547fe61891e611804b27a3f5ef0237ee',1,'cv::MergeExposures::process()'],['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html#ad6942f44b46efb5d0c6571179bfd9d48',1,'cv::MergeMertens::process(InputArrayOfArrays src, OutputArray dst, InputArray times, InputArray response) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html#a2d2254b2aab722c16954de13a663644d',1,'cv::MergeMertens::process(InputArrayOfArrays src, OutputArray dst)=0'],['https://docs.opencv.org/4.2.0/d7/d5b/classcv_1_1MergeRobertson.html#ac3657dcff146fe595329771783901b85',1,'cv::MergeRobertson::process(InputArrayOfArrays src, OutputArray dst, InputArray times, InputArray response) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d7/d5b/classcv_1_1MergeRobertson.html#ace4e270491b2e5a4cfa8fb1dd7f243a8',1,'cv::MergeRobertson::process(InputArrayOfArrays src, OutputArray dst, InputArray times)=0'],['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html#a62fc60996f8d3e30a96ee8a078e1c57b',1,'cv::linemod::Modality::process()'],['https://docs.opencv.org/4.2.0/d3/de9/classcv_1_1videostab_1_1NullOutlierRejector.html#a7f558f1e76d7f7db2ec272ceaf853dc9',1,'cv::videostab::NullOutlierRejector::process()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga5644f68f1105873b1678e0ba81d89988',1,'cv::stereo::QuasiDenseStereo::process()'],['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a549392ce4be81801262830e09e64dbf0',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation::process()'],['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#ade5839ec71229a08257c560afd7db907',1,'cv::detail::Timelapser::process()'],['https://docs.opencv.org/4.2.0/d8/d5e/classcv_1_1Tonemap.html#aa705c3b7226f7028a5c117dffab60fe4',1,'cv::Tonemap::process()'],['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a665d61ddbe148114cfcfe8dc36d3f53e',1,'cv::videostab::TranslationBasedLocalOutlierRejector::process()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga5644f68f1105873b1678e0ba81d89988',1,'process()(Global Namespace)']]], + ['processimage_587',['processImage',['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1ximgproc_1_1segmentation_1_1GraphSegmentation.html#a13a3603cb371d740c3c4b01d63553d90',1,'cv::ximgproc::segmentation::GraphSegmentation']]], + ['processimage_3a_588',['processImage:',['https://docs.opencv.org/4.2.0/d3/d54/protocolCvVideoCameraDelegate_01-p.html#a3ac80584d3c5d95f6e694af160ed4eb7',1,'CvVideoCameraDelegate -p-p']]], + ['processimpl_589',['processImpl',['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a82d035855d8fd9719e3d27d1d1e25660',1,'cv::linemod::ColorGradient::processImpl()'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a1aa7e852dc6e942ba83c14b72e2d16d3',1,'cv::linemod::DepthNormal::processImpl()'],['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html#a7d1218566fa5ceb3d0358f3c3d467c12',1,'cv::linemod::Modality::processImpl()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ab891ad01fa46db6bdb8f6b3277390b75',1,'cv::superres::SuperResolution::processImpl()']]], + ['processing_590',['Processing',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html',1,'Extended Image Processing'],['https://docs.opencv.org/4.2.0/d7/dbd/group__imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d2/df0/tutorial_js_table_of_contents_imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html',1,'NPPST Image Processing'],['https://docs.opencv.org/4.2.0/de/d25/group__npps.html',1,'NPPST Signal Processing'],['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'OpenCV iOS - Image Processing'],['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'OpenCV iOS - Video Processing'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html',1,'RGB-Depth Processing']]], + ['processing_591',['processing',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html',1,'Color space processing'],['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'Discovering the human retina and its use for image processing'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html',1,'Fuzzy image processing']]], + ['processing_20algorithms_592',['Additional photo processing algorithms',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html',1,'']]], + ['processing_20based_20on_20fuzzy_20mathematics_593',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], + ['processing_20for_20video_20capture_594',['Image Processing for Video Capture',['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'']]], + ['processing_20functionality_595',['G-API Image processing functionality',['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'']]], + ['processing_20images_20causing_20optical_20illusions_596',['Processing images causing optical illusions',['https://docs.opencv.org/4.2.0/d7/d8f/tutorial_bioinspired_retina_illusion.html',1,'']]], + ['processing_20imgproc_20module_597',['Image Processing (imgproc module)',['https://docs.opencv.org/4.2.0/d7/da8/tutorial_table_of_content_imgproc.html',1,'']]], + ['processing_20in_20opencv_598',['Image Processing in OpenCV',['https://docs.opencv.org/4.2.0/d2/d96/tutorial_py_table_of_contents_imgproc.html',1,'']]], + ['processing_20tutorials_599',['Fuzzy image processing tutorials',['https://docs.opencv.org/4.2.0/d7/d36/tutorial_fuzzy.html',1,'']]], + ['processingstarttime_5f_600',['processingStartTime_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a8debf88a6cab45a8b09035584815f5bd',1,'cv::videostab::StabilizerBase']]], + ['processnoisecov_601',['processNoiseCov',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#af19be9c0630d0f658bdbaea409a35cda',1,'cv::KalmanFilter::processNoiseCov'],['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a2f42ad9a10e19dd30b63951874cb1993',1,'cv::tracking::UnscentedKalmanFilterParams::processNoiseCov']]], + ['prod_602',['prod',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af119d9a4efe5a15cd83c1ccdf01b3a4f',1,'Eigen::DenseBase::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af119d9a4efe5a15cd83c1ccdf01b3a4f',1,'DenseBase< ArrayWrapper< ExpressionType > >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af119d9a4efe5a15cd83c1ccdf01b3a4f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af119d9a4efe5a15cd83c1ccdf01b3a4f',1,'DenseBase< Solve< Decomposition, RhsType > >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'Eigen::VectorwiseOp::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const Derived, Horizontal >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const Derived, Vertical >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::prod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01bcd17504f30b55b4910ddb75598f79',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::prod()']]], + ['product_603',['Product',['https://eigen.tuxfamily.org/dox/classEigen_1_1Product.html',1,'Eigen']]], + ['product_20expressions_604',['Writing efficient matrix product expressions',['https://eigen.tuxfamily.org/dox/TopicWritingEfficientProductExpression.html',1,'']]], + ['profile_2fbase_2eh_605',['profile/base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16604.html',1,'']]], + ['profile_2fbitset_606',['profile/bitset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16613.html',1,'']]], + ['profile_2fdeque_607',['profile/deque',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16805.html',1,'']]], + ['profile_2fforward_5flist_608',['profile/forward_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16907.html',1,'']]], + ['profile_2flist_609',['profile/list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17060.html',1,'']]], + ['profile_2fmap_610',['profile/map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17069.html',1,'']]], + ['profile_2fmap_2eh_611',['profile/map.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17078.html',1,'']]], + ['profile_2fmultimap_2eh_612',['profile/multimap.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17090.html',1,'']]], + ['profile_2fmultiset_2eh_613',['profile/multiset.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17096.html',1,'']]], + ['profile_2fset_614',['profile/set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17216.html',1,'']]], + ['profile_2fset_2eh_615',['profile/set.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17225.html',1,'']]], + ['profile_2funordered_5fmap_616',['profile/unordered_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17336.html',1,'']]], + ['profile_2funordered_5fset_617',['profile/unordered_set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17345.html',1,'']]], + ['profile_2fvector_618',['profile/vector',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17357.html',1,'']]], + ['profilelevel_619',['ProfileLevel',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a78a8efb81e3ebf8464b6b437347dbe9d',1,'cv::cudacodec::EncoderParams']]], + ['profiler_2eh_620',['profiler.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00824.html',1,'']]], + ['profiler_5falgos_2eh_621',['profiler_algos.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00827.html',1,'']]], + ['profiler_5fcontainer_5fsize_2eh_622',['profiler_container_size.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00830.html',1,'']]], + ['profiler_5fhash_5ffunc_2eh_623',['profiler_hash_func.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00833.html',1,'']]], + ['profiler_5fhashtable_5fsize_2eh_624',['profiler_hashtable_size.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00836.html',1,'']]], + ['profiler_5flist_5fto_5fslist_2eh_625',['profiler_list_to_slist.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00839.html',1,'']]], + ['profiler_5flist_5fto_5fvector_2eh_626',['profiler_list_to_vector.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00842.html',1,'']]], + ['profiler_5fmap_5fto_5funordered_5fmap_2eh_627',['profiler_map_to_unordered_map.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00845.html',1,'']]], + ['profiler_5fnode_2eh_628',['profiler_node.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00848.html',1,'']]], + ['profiler_5fstate_2eh_629',['profiler_state.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00851.html',1,'']]], + ['profiler_5ftrace_2eh_630',['profiler_trace.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00854.html',1,'']]], + ['profiler_5fvector_5fsize_2eh_631',['profiler_vector_size.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00857.html',1,'']]], + ['profiler_5fvector_5fto_5flist_2eh_632',['profiler_vector_to_list.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00860.html',1,'']]], + ['profilingtimerresolution_633',['profilingTimerResolution',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#adb4347c68d8d00a71f43d97001c2317c',1,'cv::ocl::Device']]], + ['program_634',['Program',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html',1,'cv::ocl::Program'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a5cda416295d66e370dd288a800d39c05',1,'cv::ocl::Program::Program()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a35356fa973803991f9ebcefdf9cc61b1',1,'cv::ocl::Program::Program(const ProgramSource &src, const String &buildflags, String &errmsg)'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a5c50073baeb930dd9c42b5eaafd4ca0b',1,'cv::ocl::Program::Program(const Program &prog)']]], + ['programs_635',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], + ['programsource_636',['ProgramSource',['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html',1,'cv::ocl::ProgramSource'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a00ba4e2e29ab3ccd6d7f199353ab7b86',1,'cv::ocl::ProgramSource::ProgramSource()'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a689ea52f5cf8764ad2f1cee059fd8deb',1,'cv::ocl::ProgramSource::ProgramSource(const String &module, const String &name, const String &codeStr, const String &codeHash)'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a3ed31c460b18b357141da02992948aa9',1,'cv::ocl::ProgramSource::ProgramSource(const String &prog)'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a6be45d80a058e0ab2f708bdb147e47cf',1,'cv::ocl::ProgramSource::ProgramSource(const char *prog)'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a9a3b4acc6de763477f9b039125a26dbf',1,'cv::ocl::ProgramSource::ProgramSource(const ProgramSource &prog)']]], + ['proj_5fspherical_5feqrect_637',['PROJ_SPHERICAL_EQRECT',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggace497823594b601f2094d32dde6a3c94a62d8708c29117854d6903d8e1155d8c0',1,'cv::PROJ_SPHERICAL_EQRECT'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggace497823594b601f2094d32dde6a3c94a62d8708c29117854d6903d8e1155d8c0',1,'PROJ_SPHERICAL_EQRECT(Global Namespace)']]], + ['proj_5fspherical_5fortho_638',['PROJ_SPHERICAL_ORTHO',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggace497823594b601f2094d32dde6a3c94aad55e201c84b7c538455a69153d5e676',1,'cv::PROJ_SPHERICAL_ORTHO'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggace497823594b601f2094d32dde6a3c94aad55e201c84b7c538455a69153d5e676',1,'PROJ_SPHERICAL_ORTHO(Global Namespace)']]], + ['project_639',['project',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1face_1_1FacemarkLBF_1_1BBox.html#a5516967ef0ca522b9b183ae05907bdc3',1,'cv::face::FacemarkLBF::BBox::project()'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#ac8b4067465dda3972a74d4f15ef1087c',1,'cv::LDA::project()'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a67c9a3f8fe804f40be58c88a3ae73f41',1,'cv::PCA::project(InputArray vec) const'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a0d02b263028cdf5267229f334020c632',1,'cv::PCA::project(InputArray vec, OutputArray result) const']]], + ['project1st_640',['project1st',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09187.html',1,'__gnu_cxx::project1st< class, class >'],['https://docs.opencv.org/4.2.0/d3/dea/structcv_1_1cudev_1_1project1st.html',1,'cv::cudev::project1st< class, class >']]], + ['project2nd_641',['project2nd',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09191.html',1,'__gnu_cxx::project2nd< class, class >'],['https://docs.opencv.org/4.2.0/d2/dd5/structcv_1_1cudev_1_1project2nd.html',1,'cv::cudev::project2nd< class, class >']]], + ['projection_642',['Projection',['https://docs.opencv.org/4.2.0/da/d7f/tutorial_back_projection.html',1,'Back Projection'],['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html',1,'Projection']]], + ['projection_643',['projection',['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a855dec52efed47121fc5cd47fdf808f7',1,'Eigen::Hyperplane::projection()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a37c3fe8af9a90adce20b1f6ee62c04ea',1,'Eigen::ParametrizedLine::projection()']]], + ['projection_2ehpp_644',['projection.hpp',['https://docs.opencv.org/4.2.0/d0/dbd/projection_8hpp.html',1,'']]], + ['projectionfromkrt_645',['projectionFromKRt',['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#ga2daa5a23fd362c8950ff9256c690fed8',1,'cv::sfm::projectionFromKRt()'],['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#ga2daa5a23fd362c8950ff9256c690fed8',1,'projectionFromKRt()(Global Namespace)']]], + ['projectionsfromfundamental_646',['projectionsFromFundamental',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gae29b41e17673893a3fb0ed6c38f2d23e',1,'cv::sfm::projectionsFromFundamental()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gae29b41e17673893a3fb0ed6c38f2d23e',1,'projectionsFromFundamental()(Global Namespace)']]], + ['projective_647',['Projective',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaee59a86102f150923b0cac6d4ff05107a0f7338b8672884554e8642bce9e44183',1,'Eigen::Projective'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaee59a86102f150923b0cac6d4ff05107a0f7338b8672884554e8642bce9e44183',1,'Projective(Global Namespace)']]], + ['projector_5f_648',['projector_',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'cv::detail::RotationWarperBase::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< CompressedRectilinearPortraitProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< CompressedRectilinearProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< CylindricalPortraitProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< CylindricalProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< FisheyeProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< MercatorProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< PaniniPortraitProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< PaniniProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< PlanePortraitProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< PlaneProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< SphericalPortraitProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< SphericalProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< StereographicProjector >::projector_'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a45db95bc22592f2aaef5e311ea23124c',1,'RotationWarperBase< TransverseMercatorProjector >::projector_']]], + ['projectorbase_649',['ProjectorBase',['https://docs.opencv.org/4.2.0/dc/d2c/structcv_1_1detail_1_1ProjectorBase.html',1,'cv::detail']]], + ['projectpoints_650',['projectPoints',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga1019495a2c8d1743ed5cc23fa0daff8c',1,'cv::projectPoints()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gabf8ec08fb71c5c3402cf7bb72e078d43',1,'cv::cuda::projectPoints()'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gab1ad1dc30c42ee1a50ce570019baf2c4',1,'cv::fisheye::projectPoints(InputArray objectPoints, OutputArray imagePoints, const Affine3d &affine, InputArray K, InputArray D, double alpha=0, OutputArray jacobian=noArray())'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga719a1b99cd5cb1fec92d0d1aedbb6841',1,'cv::fisheye::projectPoints(InputArray objectPoints, OutputArray imagePoints, InputArray rvec, InputArray tvec, InputArray K, InputArray D, double alpha=0, OutputArray jacobian=noArray())'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gaa56e2e41ffcca9aaf9862279066778de',1,'cv::omnidir::projectPoints()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga1019495a2c8d1743ed5cc23fa0daff8c',1,'projectPoints(InputArray objectPoints, InputArray rvec, InputArray tvec, InputArray cameraMatrix, InputArray distCoeffs, OutputArray imagePoints, OutputArray jacobian=noArray(), double aspectRatio=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gab1ad1dc30c42ee1a50ce570019baf2c4',1,'projectPoints(InputArray objectPoints, OutputArray imagePoints, const Affine3d &affine, InputArray K, InputArray D, double alpha=0, OutputArray jacobian=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga719a1b99cd5cb1fec92d0d1aedbb6841',1,'projectPoints(InputArray objectPoints, OutputArray imagePoints, InputArray rvec, InputArray tvec, InputArray K, InputArray D, double alpha=0, OutputArray jacobian=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gaa56e2e41ffcca9aaf9862279066778de',1,'projectPoints(InputArray objectPoints, OutputArray imagePoints, InputArray rvec, InputArray tvec, InputArray K, double xi, InputArray D, OutputArray jacobian=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gabf8ec08fb71c5c3402cf7bb72e078d43',1,'projectPoints(const GpuMat &src, const Mat &rvec, const Mat &tvec, const Mat &camera_mat, const Mat &dist_coef, GpuMat &dst, Stream &stream=Stream::Null())(Global Namespace)']]], + ['projects_651',['Using Eigen in CMake Projects',['https://eigen.tuxfamily.org/dox/TopicCMakeGuide.html',1,'']]], + ['projects_652',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], + ['promise_653',['promise',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02251.html',1,'std']]], + ['promise_3c_20_5fres_20_26_20_3e_654',['promise< _Res & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02371.html',1,'std']]], + ['promise_3c_20void_20_3e_655',['promise< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02375.html',1,'std']]], + ['promise_5falready_5fsatisfied_656',['promise_already_satisfied',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a9327d6f7b9aca59b62b436696fd17a00',1,'promise_already_satisfied(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a9327d6f7b9aca59b62b436696fd17a00',1,'promise_already_satisfied(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a9327d6f7b9aca59b62b436696fd17a00',1,'promise_already_satisfied(Global Namespace)']]], + ['propagate_5fconst_657',['propagate_const',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10135.html',1,'std::experimental::fundamentals_v2::propagate_const< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01019.html',1,'(Global Namespace)']]], + ['propagate_5fon_5fcontainer_5fcopy_5fassignment_658',['propagate_on_container_copy_assignment',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#acd5ad3d84299a655ad2c59e2345b7796',1,'__alloc_traits< _Tp_alloc_type >::propagate_on_container_copy_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#acd5ad3d84299a655ad2c59e2345b7796',1,'__gnu_cxx::__alloc_traits::propagate_on_container_copy_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#acd5ad3d84299a655ad2c59e2345b7796',1,'allocator_traits< _Tp_alloc_type >::propagate_on_container_copy_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#acd5ad3d84299a655ad2c59e2345b7796',1,'std::allocator_traits::propagate_on_container_copy_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#aead0578ced7c066e9a89d1cb5825c5df',1,'std::allocator_traits< allocator< _Tp > >::propagate_on_container_copy_assignment']]], + ['propagate_5fon_5fcontainer_5fmove_5fassignment_659',['propagate_on_container_move_assignment',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a1db75f5aec19020544743134c961f607',1,'__alloc_traits< _Tp_alloc_type >::propagate_on_container_move_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a1db75f5aec19020544743134c961f607',1,'__gnu_cxx::__alloc_traits::propagate_on_container_move_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a1db75f5aec19020544743134c961f607',1,'allocator_traits< _Tp_alloc_type >::propagate_on_container_move_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a1db75f5aec19020544743134c961f607',1,'std::allocator_traits::propagate_on_container_move_assignment'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#ab636a9fa7ab57a25ec043f171371976f',1,'std::allocator_traits< allocator< _Tp > >::propagate_on_container_move_assignment']]], + ['propagate_5fon_5fcontainer_5fswap_660',['propagate_on_container_swap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#adad7997e545350e38d1b44d01568741a',1,'__alloc_traits< _Tp_alloc_type >::propagate_on_container_swap'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#adad7997e545350e38d1b44d01568741a',1,'__gnu_cxx::__alloc_traits::propagate_on_container_swap'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#adad7997e545350e38d1b44d01568741a',1,'allocator_traits< _Tp_alloc_type >::propagate_on_container_swap'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#adad7997e545350e38d1b44d01568741a',1,'std::allocator_traits::propagate_on_container_swap'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a37863f3ca5e214592282792a1741219f',1,'std::allocator_traits< allocator< _Tp > >::propagate_on_container_swap']]], + ['propagatefast_661',['PropagateFast',['https://eigen.tuxfamily.org/dox/group__enums.html#gga7f4e3f96895bdb325eab1a0b651e211fa917fa8982b7eb0cbb440d38ee50e0b9c',1,'Eigen::PropagateFast'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga7f4e3f96895bdb325eab1a0b651e211fa917fa8982b7eb0cbb440d38ee50e0b9c',1,'PropagateFast(Global Namespace)']]], + ['propagatenan_662',['PropagateNaN',['https://eigen.tuxfamily.org/dox/group__enums.html#gga7f4e3f96895bdb325eab1a0b651e211fa1d414f9966ecba69cd840b8def472c4a',1,'Eigen::PropagateNaN'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga7f4e3f96895bdb325eab1a0b651e211fa1d414f9966ecba69cd840b8def472c4a',1,'PropagateNaN(Global Namespace)']]], + ['propagatenumbers_663',['PropagateNumbers',['https://eigen.tuxfamily.org/dox/group__enums.html#gga7f4e3f96895bdb325eab1a0b651e211fa5bfaff916ad4913fd04fe2e92c5c32ae',1,'Eigen::PropagateNumbers'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga7f4e3f96895bdb325eab1a0b651e211fa5bfaff916ad4913fd04fe2e92c5c32ae',1,'PropagateNumbers(Global Namespace)']]], + ['propagating_20wrapper_664',['Const-propagating wrapper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01526.html',1,'']]], + ['propagationparameters_665',['PropagationParameters',['https://docs.opencv.org/4.2.0/de/dfc/structcv_1_1stereo_1_1PropagationParameters.html',1,'cv::stereo']]], + ['properties_666',['Properties',['https://docs.opencv.org/4.2.0/d1/d32/tutorial_py_contour_properties.html',1,'Contour Properties'],['https://docs.opencv.org/4.2.0/da/dc1/tutorial_js_contour_properties.html',1,'Contour Properties']]], + ['proposallayer_667',['ProposalLayer',['https://docs.opencv.org/4.2.0/da/d6b/classcv_1_1dnn_1_1ProposalLayer.html',1,'cv::dnn']]], + ['prototometa_668',['ProtoToMeta',['https://docs.opencv.org/4.2.0/dd/ddb/structcv_1_1detail_1_1ProtoToMeta.html',1,'cv::detail']]], + ['prototometa_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_669',['ProtoToMeta< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/dd/d51/structcv_1_1detail_1_1ProtoToMeta_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], + ['prototometa_3c_20cv_3a_3agmat_20_3e_670',['ProtoToMeta< cv::GMat >',['https://docs.opencv.org/4.2.0/d0/d99/structcv_1_1detail_1_1ProtoToMeta_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], + ['prototometa_3c_20cv_3a_3agscalar_20_3e_671',['ProtoToMeta< cv::GScalar >',['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1detail_1_1ProtoToMeta_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], + ['prototometat_672',['ProtoToMetaT',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a46e15ae8b51789699cbd73c6f25d736e',1,'cv::detail']]], + ['prototoparam_673',['ProtoToParam',['https://docs.opencv.org/4.2.0/dd/dc5/structcv_1_1detail_1_1ProtoToParam.html',1,'cv::detail']]], + ['prototoparam_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_674',['ProtoToParam< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/d5/d57/structcv_1_1detail_1_1ProtoToParam_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], + ['prototoparam_3c_20cv_3a_3agmat_20_3e_675',['ProtoToParam< cv::GMat >',['https://docs.opencv.org/4.2.0/dc/dc8/structcv_1_1detail_1_1ProtoToParam_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], + ['prototoparam_3c_20cv_3a_3agscalar_20_3e_676',['ProtoToParam< cv::GScalar >',['https://docs.opencv.org/4.2.0/de/d65/structcv_1_1detail_1_1ProtoToParam_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], + ['prototoparamt_677',['ProtoToParamT',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a8832b78b39ecff459d1d91a371c7a8b3',1,'cv::detail']]], + ['prune_678',['prune',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0e5f8cc59ee57207f0cff6b142bcdd0d',1,'Eigen::SparseMatrix::prune(const KeepFunc &keep=KeepFunc())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a08af03b2fc6c371c8be4fcd62509288c',1,'Eigen::SparseMatrix::prune(const Scalar &reference, const RealScalar &epsilon=NumTraits< RealScalar >::dummy_precision())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0e5f8cc59ee57207f0cff6b142bcdd0d',1,'SparseMatrix< Scalar >::prune(const KeepFunc &keep=KeepFunc())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a08af03b2fc6c371c8be4fcd62509288c',1,'SparseMatrix< Scalar >::prune(const Scalar &reference, const RealScalar &epsilon=NumTraits< RealScalar >::dummy_precision())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0e5f8cc59ee57207f0cff6b142bcdd0d',1,'SparseMatrix< Scalar, ColMajor, int >::prune(const KeepFunc &keep=KeepFunc())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a08af03b2fc6c371c8be4fcd62509288c',1,'SparseMatrix< Scalar, ColMajor, int >::prune(const Scalar &reference, const RealScalar &epsilon=NumTraits< RealScalar >::dummy_precision())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0e5f8cc59ee57207f0cff6b142bcdd0d',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::prune(const KeepFunc &keep=KeepFunc())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a08af03b2fc6c371c8be4fcd62509288c',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::prune(const Scalar &reference, const RealScalar &epsilon=NumTraits< RealScalar >::dummy_precision())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0e5f8cc59ee57207f0cff6b142bcdd0d',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::prune(const KeepFunc &keep=KeepFunc())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a08af03b2fc6c371c8be4fcd62509288c',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::prune(const Scalar &reference, const RealScalar &epsilon=NumTraits< RealScalar >::dummy_precision())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#a2304bf75c891bcf5545783d5eb3284ed',1,'Eigen::SparseVector::prune()']]], + ['pruned_679',['pruned',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac8d0414b56d9d620ce9a698c1b281e5d',1,'Eigen::SparseMatrixBase::pruned()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac8d0414b56d9d620ce9a698c1b281e5d',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::pruned()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac8d0414b56d9d620ce9a698c1b281e5d',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::pruned()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac8d0414b56d9d620ce9a698c1b281e5d',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::pruned()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac8d0414b56d9d620ce9a698c1b281e5d',1,'SparseMatrixBase< Transpose< MatrixType > >::pruned()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac8d0414b56d9d620ce9a698c1b281e5d',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::pruned()']]], + ['ps_680',['ps',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a09c03d881042a98a2e2a751bf2f5531d',1,'cv::dnn::DictValue']]], + ['pseudoeigenvaluematrix_681',['pseudoEigenvalueMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a4979eafe0aeef06b19ada7fa5e19db17',1,'Eigen::EigenSolver']]], + ['pseudoeigenvectors_682',['pseudoEigenvectors',['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a4e796226f06e1f7347cf03a38755a155',1,'Eigen::EigenSolver']]], + ['pseudoinverse_683',['pseudoInverse',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a3c89639299720ce089435d26d6822d6f',1,'Eigen::CompleteOrthogonalDecomposition']]], + ['psm_5fauto_684',['PSM_AUTO',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba592c3b182ce902537d8aaed3e00d4d8c',1,'cv::text::PSM_AUTO'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba592c3b182ce902537d8aaed3e00d4d8c',1,'PSM_AUTO(Global Namespace)']]], + ['psm_5fauto_5fonly_685',['PSM_AUTO_ONLY',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba941826c53c13b78c57cb79d2a66062bc',1,'cv::text::PSM_AUTO_ONLY'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba941826c53c13b78c57cb79d2a66062bc',1,'PSM_AUTO_ONLY(Global Namespace)']]], + ['psm_5fauto_5fosd_686',['PSM_AUTO_OSD',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba45394fc9b8bcf757170c7951aa0a833c',1,'cv::text::PSM_AUTO_OSD'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba45394fc9b8bcf757170c7951aa0a833c',1,'PSM_AUTO_OSD(Global Namespace)']]], + ['psm_5fcircle_5fword_687',['PSM_CIRCLE_WORD',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba7086bc9fce731b1a2804aa15a118ec97',1,'cv::text::PSM_CIRCLE_WORD'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba7086bc9fce731b1a2804aa15a118ec97',1,'PSM_CIRCLE_WORD(Global Namespace)']]], + ['psm_5fosd_5fonly_688',['PSM_OSD_ONLY',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba7f263fe084bd2b66918ca1b8828c7f7d',1,'cv::text::PSM_OSD_ONLY'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba7f263fe084bd2b66918ca1b8828c7f7d',1,'PSM_OSD_ONLY(Global Namespace)']]], + ['psm_5fsingle_5fblock_689',['PSM_SINGLE_BLOCK',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576baa3e77010118ac2ec965fa9b0bb55bbc8',1,'cv::text::PSM_SINGLE_BLOCK'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576baa3e77010118ac2ec965fa9b0bb55bbc8',1,'PSM_SINGLE_BLOCK(Global Namespace)']]], + ['psm_5fsingle_5fblock_5fvert_5ftext_690',['PSM_SINGLE_BLOCK_VERT_TEXT',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba9df2b8ca6b05b6c4595d63ffe1ed5d65',1,'cv::text::PSM_SINGLE_BLOCK_VERT_TEXT'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba9df2b8ca6b05b6c4595d63ffe1ed5d65',1,'PSM_SINGLE_BLOCK_VERT_TEXT(Global Namespace)']]], + ['psm_5fsingle_5fchar_691',['PSM_SINGLE_CHAR',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba31569ebd7f6f05aa73ab1021622377e4',1,'cv::text::PSM_SINGLE_CHAR'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba31569ebd7f6f05aa73ab1021622377e4',1,'PSM_SINGLE_CHAR(Global Namespace)']]], + ['psm_5fsingle_5fcolumn_692',['PSM_SINGLE_COLUMN',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba12b616117a78aed4be8eb43cc5f3266a',1,'cv::text::PSM_SINGLE_COLUMN'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba12b616117a78aed4be8eb43cc5f3266a',1,'PSM_SINGLE_COLUMN(Global Namespace)']]], + ['psm_5fsingle_5fline_693',['PSM_SINGLE_LINE',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba7e8598b350f3caf72196e723e5b210e3',1,'cv::text::PSM_SINGLE_LINE'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba7e8598b350f3caf72196e723e5b210e3',1,'PSM_SINGLE_LINE(Global Namespace)']]], + ['psm_5fsingle_5fword_694',['PSM_SINGLE_WORD',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba66b6336634f7fa1f726d7c1fc30b811e',1,'cv::text::PSM_SINGLE_WORD'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gga32b394fdfb46625c2134d5456c78576ba66b6336634f7fa1f726d7c1fc30b811e',1,'PSM_SINGLE_WORD(Global Namespace)']]], + ['psnr_695',['PSNR',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3119e3ea73010a6f810bb05aa36ac8d6',1,'cv::PSNR()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3119e3ea73010a6f810bb05aa36ac8d6',1,'PSNR()(Global Namespace)']]], + ['psp_696',['PSP',['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html#gga06e837be12dab197606d1155a8b94025a1642d3774551cc6161f49359cc4dd3af',1,'cv::structured_light::PSP'],['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html#gga06e837be12dab197606d1155a8b94025a1642d3774551cc6161f49359cc4dd3af',1,'PSP(Global Namespace)']]], + ['psr_5fthreshold_697',['psr_threshold',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a7ff9f25f5740f44446b5df02880f46db',1,'cv::TrackerCSRT::Params']]], + ['psrcframe0_698',['pSrcFrame0',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a398a28ba1e7af34471d940b0690d8cae',1,'NppStInterpolationState']]], + ['psrcframe1_699',['pSrcFrame1',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#afbfa0c057c3ce565a66b8a153a6b8d7b',1,'NppStInterpolationState']]], + ['psroioutchannels_700',['psRoiOutChannels',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a4310e0b49d2e862fed6656c87d42a0a8',1,'cv::dnn::PoolingLayer']]], + ['pt_701',['pt',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a9502f2f63fc1d4d15d10730359e750f5',1,'cv::line_descriptor::KeyLine::pt'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#ae6b87d798d3e181a472b08fa33883abe',1,'cv::KeyPoint::pt'],['https://docs.opencv.org/4.2.0/d4/dbc/structcv_1_1Subdiv2D_1_1QuadEdge.html#acb6f3f8fbce5e5bd0f9db093c22c5cad',1,'cv::Subdiv2D::QuadEdge::pt'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#af7c97e4007500c064872ea46d0bab26b',1,'cv::Subdiv2D::Vertex::pt']]], + ['pt1_702',['pt1',['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#a0e00f31263cdee3b28c02db8725bf7b5',1,'cv::gapi::wip::draw::Line']]], + ['pt2_703',['pt2',['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#a6373d437d78b2868f3ecdae6ee01b9f5',1,'cv::gapi::wip::draw::Line']]], + ['ptloc_5ferror_704',['PTLOC_ERROR',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1f6cf51be5842d9cf1323b4231f07597a250bb6debdc855cc6bc204454f516d3b',1,'cv::Subdiv2D']]], + ['ptloc_5finside_705',['PTLOC_INSIDE',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1f6cf51be5842d9cf1323b4231f07597ae417a0101ccdd133278862bc7e6dcea0',1,'cv::Subdiv2D']]], + ['ptloc_5fon_5fedge_706',['PTLOC_ON_EDGE',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1f6cf51be5842d9cf1323b4231f07597adce5c8dff4cd9e6c2e0060dbc9a6f3b6',1,'cv::Subdiv2D']]], + ['ptloc_5foutside_5frect_707',['PTLOC_OUTSIDE_RECT',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1f6cf51be5842d9cf1323b4231f07597a79867dca35f0d88ad21969460b533ae1',1,'cv::Subdiv2D']]], + ['ptloc_5fvertex_708',['PTLOC_VERTEX',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1f6cf51be5842d9cf1323b4231f07597ac78fcef37382840c75b46eb06af11350',1,'cv::Subdiv2D']]], + ['ptr_709',['Ptr',['https://docs.opencv.org/4.2.0/da/d03/classcv_1_1gapi_1_1wip_1_1IStreamSource.html#afa9caf180bca701df9b10a6974eaa8ff',1,'cv::gapi::wip::IStreamSource::Ptr'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga6395ca871a678020c4a31fadf7e8cc63',1,'cv::Ptr'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga6395ca871a678020c4a31fadf7e8cc63',1,'Ptr(Global Namespace)']]], + ['ptr_710',['ptr',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a194ac92b66c003787e0782bd8a38750b',1,'cv::AutoBuffer::ptr'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a194ac92b66c003787e0782bd8a38750b',1,'AutoBuffer< double, 1 >::ptr'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a194ac92b66c003787e0782bd8a38750b',1,'AutoBuffer< int64, 1 >::ptr'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a194ac92b66c003787e0782bd8a38750b',1,'AutoBuffer< String, 1 >::ptr'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a9fc3f91adc5a20c6841c083cc89178d3',1,'cv::LineIterator::ptr'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a5904a30e2069349bca792b54dcf02de7',1,'cv::MatConstIterator::ptr'],['https://docs.opencv.org/4.2.0/d6/d86/structNCVMemPtr.html#a7d7da54f1b3c34b8867c51520150118e',1,'NCVMemPtr::ptr'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a436e094b8015b0d904efca35186f21d6',1,'cv::SparseMatConstIterator::ptr'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#acfd4507921bb1de80e41b7d39b3d73ce',1,'cv::ocl::Context::ptr()'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a8640958194e2448f958983a808dc4e36',1,'cv::ocl::Device::ptr()'],['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html#aad117cd27428a963bd1a5958910e064c',1,'cv::dnn::Dict::ptr(const String &key)'],['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html#acae8058cc74a14207d7d5b9dfa938a3f',1,'cv::dnn::Dict::ptr(const String &key) const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a8c9aedf97e18e6b354368f70cb83f876',1,'cv::FileNode::ptr()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae2d63376445a5365b0a5457c666d6f78',1,'cv::FileNode::ptr() const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#aa83fa0825c60eb22a11a87a98c3cd5ed',1,'cv::cuda::GpuMat::ptr(int y=0)'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ad95918b9342332a41a584b21134b0959',1,'cv::cuda::GpuMat::ptr(int y=0) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#af0389962003eec644007c7ca85a04f6d',1,'cv::cuda::GpuMat::ptr(int y=0)'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a2d7003ff9fa0a24c5e4986174c29820f',1,'cv::cuda::GpuMat::ptr(int y=0) const'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#a26c16086f0106c08df0152871aca1e6d',1,'cv::ocl::Image2D::ptr()'],['https://docs.opencv.org/4.2.0/da/d03/classcv_1_1gapi_1_1wip_1_1IStreamSource.html#ad3d4f3f6fb1f275bd04d574b5add03d4',1,'cv::gapi::wip::IStreamSource::ptr()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#aaa89be975dd21c23ee86ff1ad977d2e2',1,'cv::ocl::Kernel::ptr()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a13acd320291229615ef15f96ff1ff738',1,'cv::Mat::ptr(int i0=0)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af13f821918f452657f53bc3f750323cb',1,'cv::Mat::ptr(int i0=0) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af774caab4a38c6f7890f3254ad71eccf',1,'cv::Mat::ptr(int row, int col)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#abcfcc1798528b49495e1263eab31127d',1,'cv::Mat::ptr(int row, int col) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ad2bc0c6a23243540e16607868c17be92',1,'cv::Mat::ptr(int i0, int i1, int i2)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#abfb233ffa8b26a78c36e733f61da2a3e',1,'cv::Mat::ptr(int i0, int i1, int i2) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ab0e3de187bb27c384269b243e8789ba9',1,'cv::Mat::ptr(const int *idx)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a3ef72b9ebc9581796ed68382df8fb064',1,'cv::Mat::ptr(const int *idx) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a7ce1d8cc9a83ae7cab79766d0eb6c0a8',1,'cv::Mat::ptr(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a9ea1a1bfbbb2393a4e162230dccbe1f0',1,'cv::Mat::ptr(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a5a9ffc908ac90604f36a8b6a1038747d',1,'cv::Mat::ptr(int i0=0)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a6a6b3696440fe48751bfe60fe2a729f3',1,'cv::Mat::ptr(int i0=0) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a6f4278ede80e7a9fe55d8b03710e2343',1,'cv::Mat::ptr(int row, int col)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#abda2b96aa438a808b43425040a7da81a',1,'cv::Mat::ptr(int row, int col) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a2bf43f93c5cb610b657bd6e0e091c062',1,'cv::Mat::ptr(int i0, int i1, int i2)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a476f18d2b8d99748005150b24752512d',1,'cv::Mat::ptr(int i0, int i1, int i2) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a7cb2719706bcae72d26dbc9b2fdc02e6',1,'cv::Mat::ptr(const int *idx)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ac30da0a78cd38a72e8902f52660e2543',1,'cv::Mat::ptr(const int *idx) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a36ab9a1de78fd00a4f9acf3c8a5d4d05',1,'cv::Mat::ptr(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a15cac608c7a27fb961a81b9409aaa7e8',1,'cv::Mat::ptr(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#ac7a730baeea428e9b58c20805cc56248',1,'cv::gapi::own::Mat::ptr(int row, int col=0)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#acd4caa656fb17450db51a983d20383ab',1,'cv::gapi::own::Mat::ptr(int row, int col=0) const'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#aaf48a0b8cd1827f4ed6b551592119b04',1,'NCVMatrix::ptr()'],['https://docs.opencv.org/4.2.0/dc/d73/classNCVVector.html#a882fca1c27b65510357c7e2bb300d282',1,'NCVVector::ptr()'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#accc2d0c2117c3a455fb5a30d2f36aae6',1,'cv::ocl::Platform::ptr()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a6254d08954fc8ad190e0ce8256c85a01',1,'cv::ocl::Program::ptr()'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a8d201148fb55a19e748b20b2f50a0610',1,'cv::ocl::Queue::ptr()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a810b96cf23e3cc816e7f99473b81b513',1,'cv::SparseMat::ptr(int i0, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a14e7bb6106e6b4608ddbbc394bbf585e',1,'cv::SparseMat::ptr(int i0, int i1, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#afa0e9b6331a781f1d746e77582bee8a8',1,'cv::SparseMat::ptr(int i0, int i1, int i2, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a5425bac965f62767f50c7e68a7c452a0',1,'cv::SparseMat::ptr(const int *idx, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a810b96cf23e3cc816e7f99473b81b513',1,'cv::SparseMat::ptr(int i0, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a14e7bb6106e6b4608ddbbc394bbf585e',1,'cv::SparseMat::ptr(int i0, int i1, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#afa0e9b6331a781f1d746e77582bee8a8',1,'cv::SparseMat::ptr(int i0, int i1, int i2, bool createMissing, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a5425bac965f62767f50c7e68a7c452a0',1,'cv::SparseMat::ptr(const int *idx, bool createMissing, size_t *hashval=0)']]], + ['ptr0_711',['ptr0',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#acc76bbdcf947d3040d9b6d0e0ca27714',1,'cv::LineIterator']]], + ['ptr_5ffun_712',['ptr_fun',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html#gaee61fcee12458d9d61b10f07de908134',1,'std::ptr_fun(_Result(*__x)(_Arg))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html#ga2c95cd7ca955ae3a4cbf98593456bd8e',1,'std::ptr_fun(_Result(*__x)(_Arg1, _Arg2))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html#gaee61fcee12458d9d61b10f07de908134',1,'ptr_fun(_Result(*__x)(_Arg))(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html#ga2c95cd7ca955ae3a4cbf98593456bd8e',1,'ptr_fun(_Result(*__x)(_Arg1, _Arg2))(Global Namespace)']]], + ['ptr_5fonly_713',['PTR_ONLY',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a1010adb068498c191b8079323ad790f9a11b9ffc35882068b09f14166ac3b52f5',1,'cv::ocl::KernelArg']]], + ['ptr_5fsz_5ftype_714',['ptr_sz_type',['https://docs.opencv.org/4.2.0/df/db4/structcv_1_1cudev_1_1PtrTraits_3_01Expr_3_01Body_01_4_01_4.html#a2142fd05d4bd4693e794548b00c27c37',1,'cv::cudev::PtrTraits< Expr< Body > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'cv::cudev::PtrTraitsBase::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< AffineMapPtrSz, AffineMapPtr >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op >, BinaryTransformPtr< Src1Ptr, Src2Ptr, Op > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< CommonAreaInterPtrSz< SrcPtr >, CommonAreaInterPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< ConstantPtrSz< T >, ConstantPtr< T > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< CubicInterPtrSz< SrcPtr >, CubicInterPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< DerivXPtrSz< SrcPtr >, DerivXPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< DerivYPtrSz< SrcPtr >, DerivYPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< GlobPtrSz< T >, GlobPtr< T > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< GpuMat_< T >, GlobPtr< T > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< IntegerAreaInterPtrSz< SrcPtr >, IntegerAreaInterPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< LaplacianPtrSz< ksize, SrcPtr >, LaplacianPtr< ksize, SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< LinearInterPtrSz< SrcPtr >, LinearInterPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< LutPtrSz< SrcPtr, TablePtr >, LutPtr< SrcPtr, TablePtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< NearestInterPtrSz< SrcPtr >, NearestInterPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< PerspectiveMapPtrSz, PerspectiveMapPtr >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< Ptr2DSz, Ptr2DSz >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< RemapPtr1Sz< SrcPtr, MapPtr >, RemapPtr1< SrcPtr, MapPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr >, RemapPtr2< SrcPtr, MapXPtr, MapYPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< ResizePtrSz< SrcPtr >, ResizePtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< ScharrXPtrSz< SrcPtr >, ScharrXPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< ScharrYPtrSz< SrcPtr >, ScharrYPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< SingleMaskChannelsSz< MaskPtr >, SingleMaskChannels< MaskPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< SobelXPtrSz< SrcPtr >, SobelXPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< SobelYPtrSz< SrcPtr >, SobelYPtr< SrcPtr > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< SrcPtr, SrcPtr >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< Texture< T >, TexturePtr< T > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< UnaryTransformPtrSz< SrcPtr, Op >, UnaryTransformPtr< SrcPtr, Op > >::ptr_sz_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a3dcbbadd8cb9063cdc8bef2e74db0e0c',1,'PtrTraitsBase< ZipPtrSz< PtrTuple >, ZipPtr< PtrTuple > >::ptr_sz_type']]], + ['ptr_5ftraits_2eh_715',['ptr_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00449.html',1,'']]], + ['ptr_5ftype_716',['ptr_type',['https://docs.opencv.org/4.2.0/df/db4/structcv_1_1cudev_1_1PtrTraits_3_01Expr_3_01Body_01_4_01_4.html#a87f756f1d9b9d4bbfdbd595b872a4623',1,'cv::cudev::PtrTraits< Expr< Body > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'cv::cudev::PtrTraitsBase::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< AffineMapPtrSz, AffineMapPtr >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op >, BinaryTransformPtr< Src1Ptr, Src2Ptr, Op > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< CommonAreaInterPtrSz< SrcPtr >, CommonAreaInterPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< ConstantPtrSz< T >, ConstantPtr< T > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< CubicInterPtrSz< SrcPtr >, CubicInterPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< DerivXPtrSz< SrcPtr >, DerivXPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< DerivYPtrSz< SrcPtr >, DerivYPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< GlobPtrSz< T >, GlobPtr< T > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< GpuMat_< T >, GlobPtr< T > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< IntegerAreaInterPtrSz< SrcPtr >, IntegerAreaInterPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< LaplacianPtrSz< ksize, SrcPtr >, LaplacianPtr< ksize, SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< LinearInterPtrSz< SrcPtr >, LinearInterPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< LutPtrSz< SrcPtr, TablePtr >, LutPtr< SrcPtr, TablePtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< NearestInterPtrSz< SrcPtr >, NearestInterPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< PerspectiveMapPtrSz, PerspectiveMapPtr >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< Ptr2DSz, Ptr2DSz >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< RemapPtr1Sz< SrcPtr, MapPtr >, RemapPtr1< SrcPtr, MapPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr >, RemapPtr2< SrcPtr, MapXPtr, MapYPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< ResizePtrSz< SrcPtr >, ResizePtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< ScharrXPtrSz< SrcPtr >, ScharrXPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< ScharrYPtrSz< SrcPtr >, ScharrYPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< SingleMaskChannelsSz< MaskPtr >, SingleMaskChannels< MaskPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< SobelXPtrSz< SrcPtr >, SobelXPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< SobelYPtrSz< SrcPtr >, SobelYPtr< SrcPtr > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< SrcPtr, SrcPtr >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< Texture< T >, TexturePtr< T > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< UnaryTransformPtrSz< SrcPtr, Op >, UnaryTransformPtr< SrcPtr, Op > >::ptr_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a4d4d22ee2ec49598d5f9f651b11485cf',1,'PtrTraitsBase< ZipPtrSz< PtrTuple >, ZipPtr< PtrTuple > >::ptr_type']]], + ['ptrreadonly_717',['PtrReadOnly',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a90411e7de61ef5cb3163634f0432a962',1,'cv::ocl::KernelArg']]], + ['ptrreadwrite_718',['PtrReadWrite',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a58399f09b9b3f98e6154707eb74e137f',1,'cv::ocl::KernelArg']]], + ['ptrs_719',['ptrs',['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#ab7c6aeaca3c95077786f894a549f48eb',1,'cv::NAryMatIterator']]], + ['ptrtraits_720',['PtrTraits',['https://docs.opencv.org/4.2.0/d2/d1a/structcv_1_1cudev_1_1PtrTraits.html',1,'cv::cudev']]], + ['ptrtraits_3c_20affinemapptrsz_20_3e_721',['PtrTraits< AffineMapPtrSz >',['https://docs.opencv.org/4.2.0/d5/d59/structcv_1_1cudev_1_1PtrTraits_3_01AffineMapPtrSz_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20binarytransformptrsz_3c_20src1ptr_2c_20src2ptr_2c_20op_20_3e_20_3e_722',['PtrTraits< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op > >',['https://docs.opencv.org/4.2.0/db/d13/structcv_1_1cudev_1_1PtrTraits_3_01BinaryTransformPtrSz_3_01Src1Ptr_00_01Src2Ptr_00_01Op_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20commonareainterptrsz_3c_20srcptr_20_3e_20_3e_723',['PtrTraits< CommonAreaInterPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d8/da8/structcv_1_1cudev_1_1PtrTraits_3_01CommonAreaInterPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20constantptrsz_3c_20t_20_3e_20_3e_724',['PtrTraits< ConstantPtrSz< T > >',['https://docs.opencv.org/4.2.0/d3/d15/structcv_1_1cudev_1_1PtrTraits_3_01ConstantPtrSz_3_01T_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20cubicinterptrsz_3c_20srcptr_20_3e_20_3e_725',['PtrTraits< CubicInterPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d1/d45/structcv_1_1cudev_1_1PtrTraits_3_01CubicInterPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20derivxptrsz_3c_20srcptr_20_3e_20_3e_726',['PtrTraits< DerivXPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d3/d89/structcv_1_1cudev_1_1PtrTraits_3_01DerivXPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20derivyptrsz_3c_20srcptr_20_3e_20_3e_727',['PtrTraits< DerivYPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d0/ddb/structcv_1_1cudev_1_1PtrTraits_3_01DerivYPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20expr_3c_20body_20_3e_20_3e_728',['PtrTraits< Expr< Body > >',['https://docs.opencv.org/4.2.0/df/db4/structcv_1_1cudev_1_1PtrTraits_3_01Expr_3_01Body_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20globptrsz_3c_20t_20_3e_20_3e_729',['PtrTraits< GlobPtrSz< T > >',['https://docs.opencv.org/4.2.0/dd/def/structcv_1_1cudev_1_1PtrTraits_3_01GlobPtrSz_3_01T_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20gpumat_5f_3c_20t_20_3e_20_3e_730',['PtrTraits< GpuMat_< T > >',['https://docs.opencv.org/4.2.0/de/d66/structcv_1_1cudev_1_1PtrTraits_3_01GpuMat___3_01T_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20integerareainterptrsz_3c_20srcptr_20_3e_20_3e_731',['PtrTraits< IntegerAreaInterPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d5/da1/structcv_1_1cudev_1_1PtrTraits_3_01IntegerAreaInterPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20laplacianptrsz_3c_20ksize_2c_20srcptr_20_3e_20_3e_732',['PtrTraits< LaplacianPtrSz< ksize, SrcPtr > >',['https://docs.opencv.org/4.2.0/dd/d0b/structcv_1_1cudev_1_1PtrTraits_3_01LaplacianPtrSz_3_01ksize_00_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20linearinterptrsz_3c_20srcptr_20_3e_20_3e_733',['PtrTraits< LinearInterPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d7/deb/structcv_1_1cudev_1_1PtrTraits_3_01LinearInterPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20lutptrsz_3c_20srcptr_2c_20tableptr_20_3e_20_3e_734',['PtrTraits< LutPtrSz< SrcPtr, TablePtr > >',['https://docs.opencv.org/4.2.0/d1/df8/structcv_1_1cudev_1_1PtrTraits_3_01LutPtrSz_3_01SrcPtr_00_01TablePtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20nearestinterptrsz_3c_20srcptr_20_3e_20_3e_735',['PtrTraits< NearestInterPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d7/da3/structcv_1_1cudev_1_1PtrTraits_3_01NearestInterPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20perspectivemapptrsz_20_3e_736',['PtrTraits< PerspectiveMapPtrSz >',['https://docs.opencv.org/4.2.0/db/dee/structcv_1_1cudev_1_1PtrTraits_3_01PerspectiveMapPtrSz_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20remapptr1sz_3c_20srcptr_2c_20mapptr_20_3e_20_3e_737',['PtrTraits< RemapPtr1Sz< SrcPtr, MapPtr > >',['https://docs.opencv.org/4.2.0/dd/d16/structcv_1_1cudev_1_1PtrTraits_3_01RemapPtr1Sz_3_01SrcPtr_00_01MapPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20remapptr2sz_3c_20srcptr_2c_20mapxptr_2c_20mapyptr_20_3e_20_3e_738',['PtrTraits< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr > >',['https://docs.opencv.org/4.2.0/d0/dc2/structcv_1_1cudev_1_1PtrTraits_3_01RemapPtr2Sz_3_01SrcPtr_00_01MapXPtr_00_01MapYPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20resizeptrsz_3c_20srcptr_20_3e_20_3e_739',['PtrTraits< ResizePtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/da/da2/structcv_1_1cudev_1_1PtrTraits_3_01ResizePtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20scharrxptrsz_3c_20srcptr_20_3e_20_3e_740',['PtrTraits< ScharrXPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d9/d3d/structcv_1_1cudev_1_1PtrTraits_3_01ScharrXPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20scharryptrsz_3c_20srcptr_20_3e_20_3e_741',['PtrTraits< ScharrYPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d6/d29/structcv_1_1cudev_1_1PtrTraits_3_01ScharrYPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20singlemaskchannelssz_3c_20maskptr_20_3e_20_3e_742',['PtrTraits< SingleMaskChannelsSz< MaskPtr > >',['https://docs.opencv.org/4.2.0/d4/d58/structcv_1_1cudev_1_1PtrTraits_3_01SingleMaskChannelsSz_3_01MaskPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20sobelxptrsz_3c_20srcptr_20_3e_20_3e_743',['PtrTraits< SobelXPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/dd/d73/structcv_1_1cudev_1_1PtrTraits_3_01SobelXPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20sobelyptrsz_3c_20srcptr_20_3e_20_3e_744',['PtrTraits< SobelYPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d4/d67/structcv_1_1cudev_1_1PtrTraits_3_01SobelYPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20srcptr_20_3e_745',['PtrTraits< SrcPtr >',['https://docs.opencv.org/4.2.0/d2/d1a/structcv_1_1cudev_1_1PtrTraits.html',1,'cv::cudev::PtrTraits< SrcPtr >'],['https://docs.opencv.org/4.2.0/d2/d1a/structcv_1_1cudev_1_1PtrTraits.html',1,'PtrTraits< SrcPtr >']]], + ['ptrtraits_3c_20texture_3c_20t_20_3e_20_3e_746',['PtrTraits< Texture< T > >',['https://docs.opencv.org/4.2.0/d2/db7/structcv_1_1cudev_1_1PtrTraits_3_01Texture_3_01T_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20unarytransformptrsz_3c_20srcptr_2c_20op_20_3e_20_3e_747',['PtrTraits< UnaryTransformPtrSz< SrcPtr, Op > >',['https://docs.opencv.org/4.2.0/df/d71/structcv_1_1cudev_1_1PtrTraits_3_01UnaryTransformPtrSz_3_01SrcPtr_00_01Op_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraits_3c_20zipptrsz_3c_20ptrtuple_20_3e_20_3e_748',['PtrTraits< ZipPtrSz< PtrTuple > >',['https://docs.opencv.org/4.2.0/db/d34/structcv_1_1cudev_1_1PtrTraits_3_01ZipPtrSz_3_01PtrTuple_01_4_01_4.html',1,'cv::cudev']]], + ['ptrtraitsbase_749',['PtrTraitsBase',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'cv::cudev']]], + ['ptrtraitsbase_3c_20affinemapptrsz_2c_20affinemapptr_20_3e_750',['PtrTraitsBase< AffineMapPtrSz, AffineMapPtr >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20binarytransformptrsz_3c_20src1ptr_2c_20src2ptr_2c_20op_20_3e_2c_20binarytransformptr_3c_20src1ptr_2c_20src2ptr_2c_20op_20_3e_20_3e_751',['PtrTraitsBase< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op >, BinaryTransformPtr< Src1Ptr, Src2Ptr, Op > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20commonareainterptrsz_3c_20srcptr_20_3e_2c_20commonareainterptr_3c_20srcptr_20_3e_20_3e_752',['PtrTraitsBase< CommonAreaInterPtrSz< SrcPtr >, CommonAreaInterPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20constantptrsz_3c_20t_20_3e_2c_20constantptr_3c_20t_20_3e_20_3e_753',['PtrTraitsBase< ConstantPtrSz< T >, ConstantPtr< T > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20cubicinterptrsz_3c_20srcptr_20_3e_2c_20cubicinterptr_3c_20srcptr_20_3e_20_3e_754',['PtrTraitsBase< CubicInterPtrSz< SrcPtr >, CubicInterPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20derivxptrsz_3c_20srcptr_20_3e_2c_20derivxptr_3c_20srcptr_20_3e_20_3e_755',['PtrTraitsBase< DerivXPtrSz< SrcPtr >, DerivXPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20derivyptrsz_3c_20srcptr_20_3e_2c_20derivyptr_3c_20srcptr_20_3e_20_3e_756',['PtrTraitsBase< DerivYPtrSz< SrcPtr >, DerivYPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20globptrsz_3c_20t_20_3e_2c_20globptr_3c_20t_20_3e_20_3e_757',['PtrTraitsBase< GlobPtrSz< T >, GlobPtr< T > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20gpumat_5f_3c_20t_20_3e_2c_20globptr_3c_20t_20_3e_20_3e_758',['PtrTraitsBase< GpuMat_< T >, GlobPtr< T > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20integerareainterptrsz_3c_20srcptr_20_3e_2c_20integerareainterptr_3c_20srcptr_20_3e_20_3e_759',['PtrTraitsBase< IntegerAreaInterPtrSz< SrcPtr >, IntegerAreaInterPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20laplacianptrsz_3c_20ksize_2c_20srcptr_20_3e_2c_20laplacianptr_3c_20ksize_2c_20srcptr_20_3e_20_3e_760',['PtrTraitsBase< LaplacianPtrSz< ksize, SrcPtr >, LaplacianPtr< ksize, SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20linearinterptrsz_3c_20srcptr_20_3e_2c_20linearinterptr_3c_20srcptr_20_3e_20_3e_761',['PtrTraitsBase< LinearInterPtrSz< SrcPtr >, LinearInterPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20lutptrsz_3c_20srcptr_2c_20tableptr_20_3e_2c_20lutptr_3c_20srcptr_2c_20tableptr_20_3e_20_3e_762',['PtrTraitsBase< LutPtrSz< SrcPtr, TablePtr >, LutPtr< SrcPtr, TablePtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20nearestinterptrsz_3c_20srcptr_20_3e_2c_20nearestinterptr_3c_20srcptr_20_3e_20_3e_763',['PtrTraitsBase< NearestInterPtrSz< SrcPtr >, NearestInterPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20perspectivemapptrsz_2c_20perspectivemapptr_20_3e_764',['PtrTraitsBase< PerspectiveMapPtrSz, PerspectiveMapPtr >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20ptr2dsz_2c_20ptr2dsz_20_3e_765',['PtrTraitsBase< Ptr2DSz, Ptr2DSz >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20remapptr1sz_3c_20srcptr_2c_20mapptr_20_3e_2c_20remapptr1_3c_20srcptr_2c_20mapptr_20_3e_20_3e_766',['PtrTraitsBase< RemapPtr1Sz< SrcPtr, MapPtr >, RemapPtr1< SrcPtr, MapPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20remapptr2sz_3c_20srcptr_2c_20mapxptr_2c_20mapyptr_20_3e_2c_20remapptr2_3c_20srcptr_2c_20mapxptr_2c_20mapyptr_20_3e_20_3e_767',['PtrTraitsBase< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr >, RemapPtr2< SrcPtr, MapXPtr, MapYPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20resizeptrsz_3c_20srcptr_20_3e_2c_20resizeptr_3c_20srcptr_20_3e_20_3e_768',['PtrTraitsBase< ResizePtrSz< SrcPtr >, ResizePtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20scharrxptrsz_3c_20srcptr_20_3e_2c_20scharrxptr_3c_20srcptr_20_3e_20_3e_769',['PtrTraitsBase< ScharrXPtrSz< SrcPtr >, ScharrXPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20scharryptrsz_3c_20srcptr_20_3e_2c_20scharryptr_3c_20srcptr_20_3e_20_3e_770',['PtrTraitsBase< ScharrYPtrSz< SrcPtr >, ScharrYPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20singlemaskchannelssz_3c_20maskptr_20_3e_2c_20singlemaskchannels_3c_20maskptr_20_3e_20_3e_771',['PtrTraitsBase< SingleMaskChannelsSz< MaskPtr >, SingleMaskChannels< MaskPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20sobelxptrsz_3c_20srcptr_20_3e_2c_20sobelxptr_3c_20srcptr_20_3e_20_3e_772',['PtrTraitsBase< SobelXPtrSz< SrcPtr >, SobelXPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20sobelyptrsz_3c_20srcptr_20_3e_2c_20sobelyptr_3c_20srcptr_20_3e_20_3e_773',['PtrTraitsBase< SobelYPtrSz< SrcPtr >, SobelYPtr< SrcPtr > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20srcptr_2c_20srcptr_20_3e_774',['PtrTraitsBase< SrcPtr, SrcPtr >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20texture_3c_20t_20_3e_2c_20textureptr_3c_20t_20_3e_20_3e_775',['PtrTraitsBase< Texture< T >, TexturePtr< T > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20unarytransformptrsz_3c_20srcptr_2c_20op_20_3e_2c_20unarytransformptr_3c_20srcptr_2c_20op_20_3e_20_3e_776',['PtrTraitsBase< UnaryTransformPtrSz< SrcPtr, Op >, UnaryTransformPtr< SrcPtr, Op > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrtraitsbase_3c_20zipptrsz_3c_20ptrtuple_20_3e_2c_20zipptr_3c_20ptrtuple_20_3e_20_3e_777',['PtrTraitsBase< ZipPtrSz< PtrTuple >, ZipPtr< PtrTuple > >',['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html',1,'']]], + ['ptrwriteonly_778',['PtrWriteOnly',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a54217697aa71270c29c064b7c8f462f7',1,'cv::ocl::KernelArg']]], + ['pubimbue_779',['pubimbue',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'__gnu_cxx::enc_filebuf::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'__gnu_cxx::stdio_filebuf::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'__gnu_cxx::stdio_sync_filebuf::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'basic_filebuf< char_type, traits_type >::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'basic_streambuf< _Elem, _Tr >::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'basic_streambuf< char, _Traits >::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'basic_streambuf< char, char_traits< char > >::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'std::basic_filebuf::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'std::basic_streambuf::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'std::basic_stringbuf::pubimbue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8e7a46a08c85184d8b6ea1e5d87b7736',1,'std::wbuffer_convert::pubimbue()']]], + ['pubseekoff_780',['pubseekoff',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'__gnu_cxx::enc_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'__gnu_cxx::enc_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'__gnu_cxx::stdio_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'__gnu_cxx::stdio_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'__gnu_cxx::stdio_sync_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'__gnu_cxx::stdio_sync_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_filebuf< char_type, traits_type >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_filebuf< char_type, traits_type >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_streambuf< _Elem, _Tr >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_streambuf< _Elem, _Tr >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_streambuf< char, _Traits >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_streambuf< char, _Traits >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_streambuf< char, char_traits< char > >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'basic_streambuf< char, char_traits< char > >::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::basic_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::basic_filebuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::basic_streambuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::basic_streambuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::basic_stringbuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::basic_stringbuf::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::wbuffer_convert::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#abaa4b2714067328ce4b91a503b17fa73',1,'std::wbuffer_convert::pubseekoff(off_type __off, ios_base::seekdir __way, ios_base::openmode __mode=ios_base::in|ios_base::out)']]], + ['pubseekpos_781',['pubseekpos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'__gnu_cxx::enc_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'__gnu_cxx::enc_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'__gnu_cxx::stdio_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'__gnu_cxx::stdio_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'__gnu_cxx::stdio_sync_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'__gnu_cxx::stdio_sync_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_filebuf< char_type, traits_type >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_filebuf< char_type, traits_type >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_streambuf< _Elem, _Tr >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_streambuf< _Elem, _Tr >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_streambuf< char, _Traits >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_streambuf< char, _Traits >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_streambuf< char, char_traits< char > >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'basic_streambuf< char, char_traits< char > >::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::basic_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::basic_filebuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::basic_streambuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::basic_streambuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::basic_stringbuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::basic_stringbuf::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::wbuffer_convert::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a3138ab00e52afd7a538cdffa25e21937',1,'std::wbuffer_convert::pubseekpos(pos_type __sp, ios_base::openmode __mode=ios_base::in|ios_base::out)']]], + ['pubsetbuf_782',['pubsetbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'__gnu_cxx::enc_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'__gnu_cxx::enc_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'__gnu_cxx::stdio_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'__gnu_cxx::stdio_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'__gnu_cxx::stdio_sync_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'__gnu_cxx::stdio_sync_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_filebuf< char_type, traits_type >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_filebuf< char_type, traits_type >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_streambuf< _Elem, _Tr >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_streambuf< _Elem, _Tr >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_streambuf< char, _Traits >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_streambuf< char, _Traits >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_streambuf< char, char_traits< char > >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'basic_streambuf< char, char_traits< char > >::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::basic_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::basic_filebuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::basic_streambuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::basic_streambuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::basic_stringbuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::basic_stringbuf::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::wbuffer_convert::pubsetbuf(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a51cd8c6721f963f8bf1c5474c628b70a',1,'std::wbuffer_convert::pubsetbuf(char_type *__s, streamsize __n)']]], + ['pubsync_783',['pubsync',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'__gnu_cxx::enc_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'__gnu_cxx::enc_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'__gnu_cxx::stdio_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'__gnu_cxx::stdio_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'__gnu_cxx::stdio_sync_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'__gnu_cxx::stdio_sync_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_filebuf< char_type, traits_type >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_filebuf< char_type, traits_type >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_streambuf< _Elem, _Tr >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_streambuf< _Elem, _Tr >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_streambuf< char, _Traits >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_streambuf< char, _Traits >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_streambuf< char, char_traits< char > >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'basic_streambuf< char, char_traits< char > >::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::basic_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::basic_filebuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::basic_streambuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::basic_streambuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::basic_stringbuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::basic_stringbuf::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::wbuffer_convert::pubsync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac81d2dad6dac4c185c31937ee10077ce',1,'std::wbuffer_convert::pubsync()']]], + ['pull_784',['pull',['https://docs.opencv.org/4.2.0/dd/d1c/classcv_1_1gapi_1_1wip_1_1GCaptureSource.html#a51e5143c603dd8ca571ab6dd91215ec6',1,'cv::gapi::wip::GCaptureSource::pull()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#af4c31493fc72aae2afabcbe8eec9aaa5',1,'cv::GStreamingCompiled::pull()'],['https://docs.opencv.org/4.2.0/da/d03/classcv_1_1gapi_1_1wip_1_1IStreamSource.html#aabf1343183c118fa2a5818d519fce4cc',1,'cv::gapi::wip::IStreamSource::pull()']]], + ['pulldevicetelemetry_785',['pullDeviceTelemetry',['../namespacecan.html#a7e2b4dcc5578fd7dbc59f7ccc8f2f84c',1,'can']]], + ['pullmotorposition_786',['pullMotorPosition',['../namespacecan_1_1motor.html#a26b1ed31074df37917d234af08c2aa67',1,'can::motor']]], + ['pupils_787',['pupils',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a48d68964b78b552abf1be9232169092a',1,'cv::face::FacemarkLBF::Params']]], + ['purple_788',['purple',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a8ce3de6a0b8bb7119bfbde66f8d35b1d',1,'cv::viz::Color']]], + ['push_789',['push',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a7efe15f8159c166b68a24486ec561608',1,'stack< _StateSeqT >::push()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#acf5286a0e5aa7354459ca1553ba54688',1,'std::priority_queue::push()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#a18c27834d93d4d897d92f4fa6f910edf',1,'std::queue::push()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a7efe15f8159c166b68a24486ec561608',1,'std::stack::push()']]], + ['push_5fback_790',['push_back',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af4bd5c2cb936dd363816d867aab22a61',1,'cv::Mat::push_back(const _Tp &elem)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a1cfeb3a75570697426971403fc1ddb0d',1,'cv::Mat::push_back(const Mat_< _Tp > &elem)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a6fc040ee744749ba434fd5806ce2e3f2',1,'cv::Mat::push_back(const std::vector< _Tp > &elem)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a3676bae1741459eda3771e8653357c53',1,'cv::Mat::push_back(const Mat &m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae447c4a9eff875257d755a7f8f6d15f4',1,'__gnu_cxx::__versa_string::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< _CharT >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< _CharT, _Traits, _Allocator >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< char >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< char, char_traits< char >, _Byte_alloc >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< char_type, _Traits, _Alloc >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'basic_string< value_type >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#aa261893d7576d53592700d030dedae78',1,'deque< _StateSeqT >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a164bc4a9a0f40d98579507cfa9bb0313',1,'list< __inp, __rebind_inp >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'match_results< _Bi_iter >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0825375ff9f37dd0716baeb3932a8c10',1,'std::basic_string::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#aa261893d7576d53592700d030dedae78',1,'std::deque::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a164bc4a9a0f40d98579507cfa9bb0313',1,'std::list::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'std::match_results::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a33d8f9d5743852a2ad4db802d0eaeee1',1,'std::tr2::dynamic_bitset::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'std::vector::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< __diff_type >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _CharClassT >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _CharT >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _Cmpt >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _Node *, _Nodeptr_Alloc >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _RealType >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _State< _TraitsT::char_type > >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< _StringT >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< block_type, allocator_type >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< Catalog_info * >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< double >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< int >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< result_type >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< size_t >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< std::pair< _BiIter, int > >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< std::pair< _StateIdT, std::vector > >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< std::pair< _StrTransT, _StrTransT > >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< sub_match< _Bi_iter >, _Alloc >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::push_back()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6f2144e852790296d3c62cdec92c95ce',1,'vector< sub_match< _BiIter >, _Alloc >::push_back()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab9e0253c92736db021840105d374c4c4.html#ab9e0253c92736db021840105d374c4c4',1,'nlohmann::basic_json::push_back(basic_json &&val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3405d38087e13994a5a4556065b0be6d.html#a3405d38087e13994a5a4556065b0be6d',1,'nlohmann::basic_json::push_back(const basic_json &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad704839e6a5195e3b76f22e2b9aa63ee.html#ad704839e6a5195e3b76f22e2b9aa63ee',1,'nlohmann::basic_json::push_back(const typename object_t::value_type &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4567cf75f19b1efca090f75d7a8a350a.html#a4567cf75f19b1efca090f75d7a8a350a',1,'nlohmann::basic_json::push_back(initializer_list_t init)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a697d12b5bd6205f8866691b166b7c7dc.html#a697d12b5bd6205f8866691b166b7c7dc',1,'nlohmann::json_pointer::push_back(const std::string &token)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_ac228b13596d3c34185da9fe61b570194.html#ac228b13596d3c34185da9fe61b570194',1,'nlohmann::json_pointer::push_back(std::string &&token)']]], + ['push_5fback_5f_791',['push_back_',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a57c658e2a97dda24fef1be2e625da914',1,'cv::Mat']]], + ['push_5ffront_792',['push_front',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#a2ac4fcc26b5a8e8d3db9993ca3b6f777',1,'__gnu_parallel::_RestrictedBoundedConcurrentQueue::push_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#a2ac4fcc26b5a8e8d3db9993ca3b6f777',1,'_RestrictedBoundedConcurrentQueue< pair< _RAIter, _RAIter > >::push_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5e23e99b8919a725e105786dd2bf20e9',1,'deque< _StateSeqT >::push_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a43ce26ebd4c6a1789692b7d377f332f3',1,'list< __inp, __rebind_inp >::push_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5e23e99b8919a725e105786dd2bf20e9',1,'std::deque::push_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac2d708075d40071265f0a376591ba1d7',1,'std::forward_list::push_front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a43ce26ebd4c6a1789692b7d377f332f3',1,'std::list::push_front()']]], + ['push_5fheap_793',['push_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gad2a3e8fb6069d9cd1b14c186ec125102',1,'std::push_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gac0d64c0744947b3d233779d9e9f656cc',1,'std::push_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gad2a3e8fb6069d9cd1b14c186ec125102',1,'push_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#gac0d64c0744947b3d233779d9e9f656cc',1,'push_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], + ['pushback_794',['pushBack',['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a81161c1f209a241259f22714334f0bd1',1,'cv::videostab::InpaintingPipeline::pushBack()'],['https://docs.opencv.org/4.2.0/d9/d76/classcv_1_1videostab_1_1MotionStabilizationPipeline.html#a60a77269a6d3af5749b160bb5c183e85',1,'cv::videostab::MotionStabilizationPipeline::pushBack()']]], + ['pushframeoffset_795',['pushFrameOffset',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#aab5e3560b55c6443f065ab8bf1659649',1,'cv::AVIWriteContainer']]], + ['pushframesize_796',['pushFrameSize',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#ad3cf2fc3a24023cfd7c6ba5e774e3db5',1,'cv::AVIWriteContainer']]], + ['puss_797',['puss',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#ac707e91cc2a16a5aea2cb999c53390a4',1,'cv::stereo::Matching']]], + ['put_798',['put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'basic_iostream< char >::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'basic_iostream< char >::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'basic_ostream< char >::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'basic_ostream< char >::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'basic_ostream< char, _Traits >::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'basic_ostream< char, _Traits >::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_fstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_fstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_iostream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_iostream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_ofstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_ofstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_ostream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_ostream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_ostringstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_ostringstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_stringstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a87ff182527b274a91c89fcb07ee697fc',1,'std::basic_stringstream::put(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a5570c5a84860556788a8df682a983bab',1,'std::money_put::put(iter_type __s, bool __intl, ios_base &__io, char_type __fill, long double __units) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a63f3f803e249021f43aa8efc9abf9cca',1,'std::money_put::put(iter_type __s, bool __intl, ios_base &__io, char_type __fill, const string_type &__digits) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#aee69742de1a8e31ec291c3d9ed8b6779',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, bool __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ac2219285def97823139415bcacd89e42',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, const void *__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a979896c98edc3a6fa116c277148622fb',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a1f76c7a2ddb936ac6a46cafb7e482f91',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, unsigned long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a4e520179f48db1bcd852066ce86f2b7d',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ad5858234a5d78c697063ba8190452d61',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, unsigned long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ae18fddb4a48878fe0a58abe4d7b0aca7',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, double __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a3c956b3279105a66090bdc73dd340a4b',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, long double __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a979896c98edc3a6fa116c277148622fb',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a1f76c7a2ddb936ac6a46cafb7e482f91',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, unsigned long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a4e520179f48db1bcd852066ce86f2b7d',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ad5858234a5d78c697063ba8190452d61',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, unsigned long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ae18fddb4a48878fe0a58abe4d7b0aca7',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, double __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a3c956b3279105a66090bdc73dd340a4b',1,'std::num_put::put(iter_type __s, ios_base &__io, char_type __fill, long double __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a8e6943d3a21fc654c245ac5ec60eb507',1,'std::time_put::put(iter_type __s, ios_base &__io, char_type __fill, const tm *__tm, const _CharT *__beg, const _CharT *__end) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a85643bdff3768dd8b9e0089e5c279561',1,'std::time_put::put(iter_type __s, ios_base &__io, char_type __fill, const tm *__tm, char __format, char __mod=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a8e6943d3a21fc654c245ac5ec60eb507',1,'std::time_put_byname::put(iter_type __s, ios_base &__io, char_type __fill, const tm *__tm, const _CharT *__beg, const _CharT *__end) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a85643bdff3768dd8b9e0089e5c279561',1,'std::time_put_byname::put(iter_type __s, ios_base &__io, char_type __fill, const tm *__tm, char __format, char __mod=0) const']]], + ['put_5fmoney_799',['put_money',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4223c5b3a51cbf3a2d8910fb8415bf73',1,'std']]], + ['put_5ftime_800',['put_time',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac209d7732c2ceff781a6aa0bb278db86',1,'std']]], + ['putback_801',['putback',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'basic_iostream< char >::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'basic_iostream< char >::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'basic_istream< char >::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'basic_istream< char >::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'basic_istream< char, _Traits >::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'basic_istream< char, _Traits >::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_fstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_fstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_ifstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_ifstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_iostream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_iostream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_istream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_istream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_istringstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_istringstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_stringstream::putback(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aaac4e520f0841cce4c36bd614fa6043e',1,'std::basic_stringstream::putback(char_type __c)']]], + ['putstreambyte_802',['putStreamByte',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a13d1893209953609f93746fa5702b756',1,'cv::AVIWriteContainer']]], + ['putstreambytes_803',['putStreamBytes',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a3d1a50d1ef3dacef8ef9dc70a8b110c9',1,'cv::AVIWriteContainer']]], + ['puttext_804',['putText',['https://docs.opencv.org/4.2.0/d9/dfa/classcv_1_1freetype_1_1FreeType2.html#aba641f774c47a70eaeb76bf7aa865915',1,'cv::freetype::FreeType2::putText()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga5126f47f883d730f633d74f07456c576',1,'cv::putText()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga5126f47f883d730f633d74f07456c576',1,'putText()(Global Namespace)']]], + ['pv_805',['pv',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a6031804735741aeb061c6292ebafae05',1,'cv::dnn::DictValue']]], + ['pword_806',['pword',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'basic_ios< char, _Traits >::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'basic_iostream< char >::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'basic_istream< char >::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'basic_istream< char, _Traits >::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'basic_ostream< char >::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'basic_ostream< char, _Traits >::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_fstream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_ifstream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_ios::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_iostream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_istream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_istringstream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_ofstream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_ostream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_ostringstream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::basic_stringstream::pword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a562ae8fc4f9ac0b806ab7839a8877a77',1,'std::ios_base::pword()']]], + ['px_807',['Px',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#a6d4656662b0860b16bed40411a529352',1,'cv::datasets::join']]], + ['py_808',['Py',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#a154c4f2f0edcc2dadfbbb90b379cc770',1,'cv::datasets::join']]], + ['py_5f2d_5fhistogram_2emarkdown_809',['py_2d_histogram.markdown',['https://docs.opencv.org/4.2.0/d1/d30/py__2d__histogram_8markdown.html',1,'']]], + ['py_5fbasic_5fops_2emarkdown_810',['py_basic_ops.markdown',['https://docs.opencv.org/4.2.0/d3/dc6/py__basic__ops_8markdown.html',1,'']]], + ['py_5fbg_5fsubtraction_2emarkdown_811',['py_bg_subtraction.markdown',['https://docs.opencv.org/4.2.0/df/dba/py__bg__subtraction_8markdown.html',1,'']]], + ['py_5fbindings_5fbasics_2emarkdown_812',['py_bindings_basics.markdown',['https://docs.opencv.org/4.2.0/d3/d5b/py__bindings__basics_8markdown.html',1,'']]], + ['py_5fbrief_2emarkdown_813',['py_brief.markdown',['https://docs.opencv.org/4.2.0/d1/d54/py__brief_8markdown.html',1,'']]], + ['py_5fcalibration_2emarkdown_814',['py_calibration.markdown',['https://docs.opencv.org/4.2.0/d7/da4/py__calibration_8markdown.html',1,'']]], + ['py_5fcanny_2emarkdown_815',['py_canny.markdown',['https://docs.opencv.org/4.2.0/d2/dbb/py__canny_8markdown.html',1,'']]], + ['py_5fcolorspaces_2emarkdown_816',['py_colorspaces.markdown',['https://docs.opencv.org/4.2.0/d6/d11/py__colorspaces_8markdown.html',1,'']]], + ['py_5fcontour_5ffeatures_2emarkdown_817',['py_contour_features.markdown',['https://docs.opencv.org/4.2.0/d9/d94/py__contour__features_8markdown.html',1,'']]], + ['py_5fcontour_5fproperties_2emarkdown_818',['py_contour_properties.markdown',['https://docs.opencv.org/4.2.0/d5/dc6/py__contour__properties_8markdown.html',1,'']]], + ['py_5fcontours_5fbegin_2emarkdown_819',['py_contours_begin.markdown',['https://docs.opencv.org/4.2.0/dc/d7c/py__contours__begin_8markdown.html',1,'']]], + ['py_5fcontours_5fhierarchy_2emarkdown_820',['py_contours_hierarchy.markdown',['https://docs.opencv.org/4.2.0/d0/d31/py__contours__hierarchy_8markdown.html',1,'']]], + ['py_5fcontours_5fmore_5ffunctions_2emarkdown_821',['py_contours_more_functions.markdown',['https://docs.opencv.org/4.2.0/db/db2/py__contours__more__functions_8markdown.html',1,'']]], + ['py_5fdepthmap_2emarkdown_822',['py_depthmap.markdown',['https://docs.opencv.org/4.2.0/d8/d81/py__depthmap_8markdown.html',1,'']]], + ['py_5fdrawing_5ffunctions_2emarkdown_823',['py_drawing_functions.markdown',['https://docs.opencv.org/4.2.0/d6/dd5/py__drawing__functions_8markdown.html',1,'']]], + ['py_5fepipolar_5fgeometry_2emarkdown_824',['py_epipolar_geometry.markdown',['https://docs.opencv.org/4.2.0/d9/dae/py__epipolar__geometry_8markdown.html',1,'']]], + ['py_5fface_5fdetection_2emarkdown_825',['py_face_detection.markdown',['https://docs.opencv.org/4.2.0/d6/d2a/py__face__detection_8markdown.html',1,'']]], + ['py_5ffast_2emarkdown_826',['py_fast.markdown',['https://docs.opencv.org/4.2.0/d8/dc1/py__fast_8markdown.html',1,'']]], + ['py_5ffeature_5fhomography_2emarkdown_827',['py_feature_homography.markdown',['https://docs.opencv.org/4.2.0/d4/dba/py__feature__homography_8markdown.html',1,'']]], + ['py_5ffeatures_5fharris_2emarkdown_828',['py_features_harris.markdown',['https://docs.opencv.org/4.2.0/d3/d20/py__features__harris_8markdown.html',1,'']]], + ['py_5ffeatures_5fmeaning_2emarkdown_829',['py_features_meaning.markdown',['https://docs.opencv.org/4.2.0/d5/d3f/py__features__meaning_8markdown.html',1,'']]], + ['py_5ffiltering_2emarkdown_830',['py_filtering.markdown',['https://docs.opencv.org/4.2.0/d2/d24/py__filtering_8markdown.html',1,'']]], + ['py_5ffourier_5ftransform_2emarkdown_831',['py_fourier_transform.markdown',['https://docs.opencv.org/4.2.0/d3/dc2/py__fourier__transform_8markdown.html',1,'']]], + ['py_5fgeometric_5ftransformations_2emarkdown_832',['py_geometric_transformations.markdown',['https://docs.opencv.org/4.2.0/de/d07/py__geometric__transformations_8markdown.html',1,'']]], + ['py_5fgrabcut_2emarkdown_833',['py_grabcut.markdown',['https://docs.opencv.org/4.2.0/d8/d4a/py__grabcut_8markdown.html',1,'']]], + ['py_5fgradients_2emarkdown_834',['py_gradients.markdown',['https://docs.opencv.org/4.2.0/de/d45/py__gradients_8markdown.html',1,'']]], + ['py_5fhdr_2emarkdown_835',['py_hdr.markdown',['https://docs.opencv.org/4.2.0/db/d99/py__hdr_8markdown.html',1,'']]], + ['py_5fhistogram_5fbackprojection_2emarkdown_836',['py_histogram_backprojection.markdown',['https://docs.opencv.org/4.2.0/da/dd1/py__histogram__backprojection_8markdown.html',1,'']]], + ['py_5fhistogram_5fbegins_2emarkdown_837',['py_histogram_begins.markdown',['https://docs.opencv.org/4.2.0/dc/dff/py__histogram__begins_8markdown.html',1,'']]], + ['py_5fhistogram_5fequalization_2emarkdown_838',['py_histogram_equalization.markdown',['https://docs.opencv.org/4.2.0/d9/da3/py__histogram__equalization_8markdown.html',1,'']]], + ['py_5fhoughcircles_2emarkdown_839',['py_houghcircles.markdown',['https://docs.opencv.org/4.2.0/d9/dae/py__houghcircles_8markdown.html',1,'']]], + ['py_5fhoughlines_2emarkdown_840',['py_houghlines.markdown',['https://docs.opencv.org/4.2.0/d9/da9/py__houghlines_8markdown.html',1,'']]], + ['py_5fimage_5farithmetics_2emarkdown_841',['py_image_arithmetics.markdown',['https://docs.opencv.org/4.2.0/d3/d59/py__image__arithmetics_8markdown.html',1,'']]], + ['py_5fimage_5fdisplay_2emarkdown_842',['py_image_display.markdown',['https://docs.opencv.org/4.2.0/d4/df1/py__image__display_8markdown.html',1,'']]], + ['py_5finpainting_2emarkdown_843',['py_inpainting.markdown',['https://docs.opencv.org/4.2.0/d8/d64/py__inpainting_8markdown.html',1,'']]], + ['py_5fintro_2emarkdown_844',['py_intro.markdown',['https://docs.opencv.org/4.2.0/dc/dd8/py__intro_8markdown.html',1,'']]], + ['py_5fkmeans_5findex_2emarkdown_845',['py_kmeans_index.markdown',['https://docs.opencv.org/4.2.0/d1/d7d/py__kmeans__index_8markdown.html',1,'']]], + ['py_5fkmeans_5fopencv_2emarkdown_846',['py_kmeans_opencv.markdown',['https://docs.opencv.org/4.2.0/da/dac/py__kmeans__opencv_8markdown.html',1,'']]], + ['py_5fkmeans_5funderstanding_2emarkdown_847',['py_kmeans_understanding.markdown',['https://docs.opencv.org/4.2.0/d0/d17/py__kmeans__understanding_8markdown.html',1,'']]], + ['py_5fknn_5findex_2emarkdown_848',['py_knn_index.markdown',['https://docs.opencv.org/4.2.0/d0/d0a/py__knn__index_8markdown.html',1,'']]], + ['py_5fknn_5fopencv_2emarkdown_849',['py_knn_opencv.markdown',['https://docs.opencv.org/4.2.0/de/d86/py__knn__opencv_8markdown.html',1,'']]], + ['py_5fknn_5funderstanding_2emarkdown_850',['py_knn_understanding.markdown',['https://docs.opencv.org/4.2.0/d1/dae/py__knn__understanding_8markdown.html',1,'']]], + ['py_5flucas_5fkanade_2emarkdown_851',['py_lucas_kanade.markdown',['https://docs.opencv.org/4.2.0/d3/d72/py__lucas__kanade_8markdown.html',1,'']]], + ['py_5fmatcher_2emarkdown_852',['py_matcher.markdown',['https://docs.opencv.org/4.2.0/d9/ded/py__matcher_8markdown.html',1,'']]], + ['py_5fmeanshift_2emarkdown_853',['py_meanshift.markdown',['https://docs.opencv.org/4.2.0/d4/d1f/py__meanshift_8markdown.html',1,'']]], + ['py_5fmorphological_5fops_2emarkdown_854',['py_morphological_ops.markdown',['https://docs.opencv.org/4.2.0/d3/df1/py__morphological__ops_8markdown.html',1,'']]], + ['py_5fmouse_5fhandling_2emarkdown_855',['py_mouse_handling.markdown',['https://docs.opencv.org/4.2.0/dc/d46/py__mouse__handling_8markdown.html',1,'']]], + ['py_5fnon_5flocal_5fmeans_2emarkdown_856',['py_non_local_means.markdown',['https://docs.opencv.org/4.2.0/d5/d0e/py__non__local__means_8markdown.html',1,'']]], + ['py_5foptimization_2emarkdown_857',['py_optimization.markdown',['https://docs.opencv.org/4.2.0/d8/d10/py__optimization_8markdown.html',1,'']]], + ['py_5forb_2emarkdown_858',['py_orb.markdown',['https://docs.opencv.org/4.2.0/d1/d67/py__orb_8markdown.html',1,'']]], + ['py_5fpose_2emarkdown_859',['py_pose.markdown',['https://docs.opencv.org/4.2.0/d4/d76/py__pose_8markdown.html',1,'']]], + ['py_5fpyramids_2emarkdown_860',['py_pyramids.markdown',['https://docs.opencv.org/4.2.0/d9/dd9/py__pyramids_8markdown.html',1,'']]], + ['py_5fsetup_5fin_5ffedora_2emarkdown_861',['py_setup_in_fedora.markdown',['https://docs.opencv.org/4.2.0/df/dfe/py__setup__in__fedora_8markdown.html',1,'']]], + ['py_5fsetup_5fin_5fubuntu_2emarkdown_862',['py_setup_in_ubuntu.markdown',['https://docs.opencv.org/4.2.0/d7/de5/py__setup__in__ubuntu_8markdown.html',1,'']]], + ['py_5fsetup_5fin_5fwindows_2emarkdown_863',['py_setup_in_windows.markdown',['https://docs.opencv.org/4.2.0/d9/d98/py__setup__in__windows_8markdown.html',1,'']]], + ['py_5fshi_5ftomasi_2emarkdown_864',['py_shi_tomasi.markdown',['https://docs.opencv.org/4.2.0/d3/d35/py__shi__tomasi_8markdown.html',1,'']]], + ['py_5fsift_5fintro_2emarkdown_865',['py_sift_intro.markdown',['https://docs.opencv.org/4.2.0/df/d0a/py__sift__intro_8markdown.html',1,'']]], + ['py_5fsurf_5fintro_2emarkdown_866',['py_surf_intro.markdown',['https://docs.opencv.org/4.2.0/d3/d20/py__surf__intro_8markdown.html',1,'']]], + ['py_5fsvm_5fbasics_2emarkdown_867',['py_svm_basics.markdown',['https://docs.opencv.org/4.2.0/db/d07/py__svm__basics_8markdown.html',1,'']]], + ['py_5fsvm_5findex_2emarkdown_868',['py_svm_index.markdown',['https://docs.opencv.org/4.2.0/db/dcf/py__svm__index_8markdown.html',1,'']]], + ['py_5fsvm_5fopencv_2emarkdown_869',['py_svm_opencv.markdown',['https://docs.opencv.org/4.2.0/d2/dee/py__svm__opencv_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5fbindings_2emarkdown_870',['py_table_of_contents_bindings.markdown',['https://docs.opencv.org/4.2.0/d8/d93/py__table__of__contents__bindings_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5fcalib3d_2emarkdown_871',['py_table_of_contents_calib3d.markdown',['https://docs.opencv.org/4.2.0/d3/d9b/py__table__of__contents__calib3d_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5fcontours_2emarkdown_872',['py_table_of_contents_contours.markdown',['https://docs.opencv.org/4.2.0/dd/d39/py__table__of__contents__contours_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5fcore_2emarkdown_873',['py_table_of_contents_core.markdown',['https://docs.opencv.org/4.2.0/d2/da4/py__table__of__contents__core_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5ffeature2d_2emarkdown_874',['py_table_of_contents_feature2d.markdown',['https://docs.opencv.org/4.2.0/df/d42/py__table__of__contents__feature2d_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5fgui_2emarkdown_875',['py_table_of_contents_gui.markdown',['https://docs.opencv.org/4.2.0/d5/d05/py__table__of__contents__gui_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5fhistograms_2emarkdown_876',['py_table_of_contents_histograms.markdown',['https://docs.opencv.org/4.2.0/dc/d9e/py__table__of__contents__histograms_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5fimgproc_2emarkdown_877',['py_table_of_contents_imgproc.markdown',['https://docs.opencv.org/4.2.0/dd/df3/py__table__of__contents__imgproc_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5fml_2emarkdown_878',['py_table_of_contents_ml.markdown',['https://docs.opencv.org/4.2.0/d8/d9e/py__table__of__contents__ml_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5fobjdetect_2emarkdown_879',['py_table_of_contents_objdetect.markdown',['https://docs.opencv.org/4.2.0/df/d81/py__table__of__contents__objdetect_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5fphoto_2emarkdown_880',['py_table_of_contents_photo.markdown',['https://docs.opencv.org/4.2.0/d2/dca/py__table__of__contents__photo_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5fsetup_2emarkdown_881',['py_table_of_contents_setup.markdown',['https://docs.opencv.org/4.2.0/d9/d2c/py__table__of__contents__setup_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5ftransforms_2emarkdown_882',['py_table_of_contents_transforms.markdown',['https://docs.opencv.org/4.2.0/d2/d28/py__table__of__contents__transforms_8markdown.html',1,'']]], + ['py_5ftable_5fof_5fcontents_5fvideo_2emarkdown_883',['py_table_of_contents_video.markdown',['https://docs.opencv.org/4.2.0/d0/dd8/py__table__of__contents__video_8markdown.html',1,'']]], + ['py_5ftemplate_5fmatching_2emarkdown_884',['py_template_matching.markdown',['https://docs.opencv.org/4.2.0/d2/d82/py__template__matching_8markdown.html',1,'']]], + ['py_5fthresholding_2emarkdown_885',['py_thresholding.markdown',['https://docs.opencv.org/4.2.0/d2/d6d/py__thresholding_8markdown.html',1,'']]], + ['py_5ftrackbar_2emarkdown_886',['py_trackbar.markdown',['https://docs.opencv.org/4.2.0/d5/d3c/py__trackbar_8markdown.html',1,'']]], + ['py_5ftutorials_2emarkdown_887',['py_tutorials.markdown',['https://docs.opencv.org/4.2.0/d0/d23/py__tutorials_8markdown.html',1,'']]], + ['py_5fvideo_5fdisplay_2emarkdown_888',['py_video_display.markdown',['https://docs.opencv.org/4.2.0/dd/dd2/py__video__display_8markdown.html',1,'']]], + ['py_5fwatershed_2emarkdown_889',['py_watershed.markdown',['https://docs.opencv.org/4.2.0/da/d77/py__watershed_8markdown.html',1,'']]], + ['pyramid_5fdi_5fdx_890',['pyramid_dI_dx',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#adf097ce53bf09bd35ddb9df49dc3ba4f',1,'cv::rgbd::OdometryFrame']]], + ['pyramid_5fdi_5fdy_891',['pyramid_dI_dy',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a3202c5410bb4585f213aa6a8af047a9a',1,'cv::rgbd::OdometryFrame']]], + ['pyramid_5flevel_892',['pyramid_level',['https://docs.opencv.org/4.2.0/d2/dc7/structcv_1_1linemod_1_1Template.html#a9cddfbb854bbda7dd6d9df071fc6ca1e',1,'cv::linemod::Template']]], + ['pyramid_5flevels_893',['pyramid_levels',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#ab96bceee186a7c3caa7ac8eaacfba518',1,'cv::linemod::Detector']]], + ['pyramidcloud_894',['pyramidCloud',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a1fd66704ad6fd5d55b60dacae19eb885',1,'cv::rgbd::OdometryFrame']]], + ['pyramiddepth_895',['pyramidDepth',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#ab5c1d7604a30c6423a554d197ad6328f',1,'cv::rgbd::OdometryFrame']]], + ['pyramidimage_896',['pyramidImage',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#ad1299a265c8f7a932952ac71e05a5371',1,'cv::rgbd::OdometryFrame']]], + ['pyramidlevels_897',['pyramidLevels',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a89910918a6ca854364f0b563489b14cf',1,'cv::dynafu::Params::pyramidLevels'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a868a013f0c11c7d21710544eee57426e',1,'cv::kinfu::Params::pyramidLevels'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a3a9c96fdcc0c85c5a6587576809fb135',1,'cv::linemod::Detector::pyramidLevels()']]], + ['pyramidmask_898',['pyramidMask',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a93176e62511173bd9445acfb6848dba8',1,'cv::rgbd::OdometryFrame']]], + ['pyramidnormals_899',['pyramidNormals',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a2d90e9abf37775395d4f409fab2fb217',1,'cv::rgbd::OdometryFrame']]], + ['pyramidnormalsmask_900',['pyramidNormalsMask',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a85297b72d853ee9d6a27ad89dd11ad20',1,'cv::rgbd::OdometryFrame']]], + ['pyramids_901',['Pyramids',['https://docs.opencv.org/4.2.0/d4/d1f/tutorial_pyramids.html',1,'Image Pyramids'],['https://docs.opencv.org/4.2.0/dc/dff/tutorial_py_pyramids.html',1,'Image Pyramids'],['https://docs.opencv.org/4.2.0/d5/d0f/tutorial_js_pyramids.html',1,'Image Pyramids']]], + ['pyramids_2ehpp_902',['pyramids.hpp',['https://docs.opencv.org/4.2.0/d9/d3e/pyramids_8hpp.html',1,'']]], + ['pyramids_2emarkdown_903',['pyramids.markdown',['https://docs.opencv.org/4.2.0/da/d2a/pyramids_8markdown.html',1,'']]], + ['pyramidtexturedmask_904',['pyramidTexturedMask',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#aa78145af61d994f460e8ce13e68f01c7',1,'cv::rgbd::OdometryFrame']]], + ['pyrdown_905',['pyrDown',['https://docs.opencv.org/4.2.0/d7/d6f/classcv_1_1linemod_1_1QuantizedPyramid.html#a1c201c04dd31e2eee60e58f2676459d3',1,'cv::linemod::QuantizedPyramid::pyrDown()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaf9bba239dfca11654cb7f50f889fc2ff',1,'cv::pyrDown()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga9c8456de9792d96431e065f407c7a91b',1,'cv::cuda::pyrDown()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaf9bba239dfca11654cb7f50f889fc2ff',1,'pyrDown(InputArray src, OutputArray dst, const Size &dstsize=Size(), int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga9c8456de9792d96431e065f407c7a91b',1,'pyrDown(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], + ['pyrdown_5f_906',['pyrDown_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9be12498be0657c4b8cd993626c8a23d',1,'cv::cudev::pyrDown_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9be12498be0657c4b8cd993626c8a23d',1,'pyrDown_()(Global Namespace)']]], + ['pyrdownbody_907',['PyrDownBody',['https://docs.opencv.org/4.2.0/d1/d8a/structcv_1_1cudev_1_1PyrDownBody.html',1,'cv::cudev']]], + ['pyrlkoptflowestimatorbase_908',['PyrLkOptFlowEstimatorBase',['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html',1,'cv::videostab::PyrLkOptFlowEstimatorBase'],['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html#ae6222bef78aae91f7580df19ed7217b5',1,'cv::videostab::PyrLkOptFlowEstimatorBase::PyrLkOptFlowEstimatorBase()']]], + ['pyrlkopticalflow_909',['PyrLKOpticalFlow',['https://docs.opencv.org/4.2.0/de/d2b/classcv_1_1superres_1_1PyrLKOpticalFlow.html',1,'cv::superres']]], + ['pyrmeanshiftfiltering_910',['pyrMeanShiftFiltering',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga9fabdce9543bd602445f5db3827e4cc0',1,'cv::pyrMeanShiftFiltering()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga9fabdce9543bd602445f5db3827e4cc0',1,'pyrMeanShiftFiltering()(Global Namespace)']]], + ['pyrotationwarper_911',['PyRotationWarper',['https://docs.opencv.org/4.2.0/d5/d76/classcv_1_1PyRotationWarper.html',1,'cv::PyRotationWarper'],['https://docs.opencv.org/4.2.0/d5/d76/classcv_1_1PyRotationWarper.html#addb2012225fc1060df95ce9900e77529',1,'cv::PyRotationWarper::PyRotationWarper(String type, float scale)'],['https://docs.opencv.org/4.2.0/d5/d76/classcv_1_1PyRotationWarper.html#a965c0546abb140199df38238e72e23f5',1,'cv::PyRotationWarper::PyRotationWarper()']]], + ['pyrup_912',['pyrUp',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gada75b59bdaaca411ed6fee10085eb784',1,'cv::pyrUp()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga2048da0dfdb9e4a726232c5cef7e5747',1,'cv::cuda::pyrUp()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gada75b59bdaaca411ed6fee10085eb784',1,'pyrUp(InputArray src, OutputArray dst, const Size &dstsize=Size(), int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga2048da0dfdb9e4a726232c5cef7e5747',1,'pyrUp(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], + ['pyrup_5f_913',['pyrUp_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e0229bfc11693beb833a9fa824014b1',1,'cv::cudev::pyrUp_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e0229bfc11693beb833a9fa824014b1',1,'pyrUp_()(Global Namespace)']]], + ['pyrupbody_914',['PyrUpBody',['https://docs.opencv.org/4.2.0/d1/de8/structcv_1_1cudev_1_1PyrUpBody.html',1,'cv::cudev']]], + ['python_20bindings_915',['OpenCV-Python Bindings',['https://docs.opencv.org/4.2.0/df/da2/tutorial_py_table_of_contents_bindings.html',1,'']]], + ['python_20bindings_20works_916',['How OpenCV-Python Bindings Works?',['https://docs.opencv.org/4.2.0/da/d49/tutorial_py_bindings_basics.html',1,'']]], + ['python_20in_20fedora_917',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], + ['python_20in_20ubuntu_918',['Install OpenCV-Python in Ubuntu',['https://docs.opencv.org/4.2.0/d2/de6/tutorial_py_setup_in_ubuntu.html',1,'']]], + ['python_20in_20windows_919',['Install OpenCV-Python in Windows',['https://docs.opencv.org/4.2.0/d5/de5/tutorial_py_setup_in_windows.html',1,'']]], + ['python_20tutorials_920',['Python Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'Introduction to OpenCV-Python Tutorials'],['https://docs.opencv.org/4.2.0/d6/d00/tutorial_py_root.html',1,'OpenCV-Python Tutorials']]] ]; diff --git a/search/all_1a.js b/search/all_1a.js index 576dffde..3b66c1d9 100644 --- a/search/all_1a.js +++ b/search/all_1a.js @@ -82,16 +82,15 @@ var searchData= ['querymemory_79',['queryMemory',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a5452c3b639a257950902a8f47fb54301',1,'cv::cuda::DeviceInfo']]], ['querypcflann_80',['queryPCFlann',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga1f97667a487faab9bd849341361db1a1',1,'cv::ppf_match_3d::queryPCFlann(void *flannIndex, Mat &pc, Mat &indices, Mat &distances)'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gac98a74b02d163b63ec68e8bf6ebcf8c6',1,'cv::ppf_match_3d::queryPCFlann(void *flannIndex, Mat &pc, Mat &indices, Mat &distances, const int numNeighbors)'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga1f97667a487faab9bd849341361db1a1',1,'queryPCFlann(void *flannIndex, Mat &pc, Mat &indices, Mat &distances)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gac98a74b02d163b63ec68e8bf6ebcf8c6',1,'queryPCFlann(void *flannIndex, Mat &pc, Mat &indices, Mat &distances, const int numNeighbors)(Global Namespace)']]], ['questions_81',['Frequently Asked Questions',['https://docs.opencv.org/4.2.0/d3/d2d/faq.html',1,'']]], - ['queue_82',['Queue',['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html',1,'cv::ocl']]], + ['queue_82',['Queue',['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html',1,'cv::ocl::Queue'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a702c155117f520fcd90b24ca902f861f',1,'cv::ocl::Queue::Queue()'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a62648111989b26f6067ea65ed954505e',1,'cv::ocl::Queue::Queue(const Context &c, const Device &d=Device())'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a31e41d67d14f8e12f3876e30546f7a84',1,'cv::ocl::Queue::Queue(const Queue &q)']]], ['queue_83',['queue',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html',1,'std::queue< _Tp, _Sequence >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00119.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#abdaacb8e25703a65fc79cbfa5fe6934b',1,'std::queue::queue()']]], - ['queue_84',['Queue',['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a702c155117f520fcd90b24ca902f861f',1,'cv::ocl::Queue::Queue()'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a62648111989b26f6067ea65ed954505e',1,'cv::ocl::Queue::Queue(const Context &c, const Device &d=Device())'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a31e41d67d14f8e12f3876e30546f7a84',1,'cv::ocl::Queue::Queue(const Queue &q)']]], - ['queue_2eh_85',['queue.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00950.html',1,'']]], - ['quick_20reference_20guide_86',['Quick reference guide',['https://eigen.tuxfamily.org/dox/group__QuickRefPage.html',1,'']]], - ['quick_20reference_20guide_20for_20sparse_20matrices_87',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], - ['quicksort_2eh_88',['quicksort.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00953.html',1,'']]], - ['quicksort_5ftag_89',['quicksort_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09755.html',1,'__gnu_parallel']]], - ['quiet_5fnan_90',['quiet_NaN',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#a4a252b113edcbac0881a4ff30d94b1e1',1,'std::numeric_limits']]], - ['qunitary_91',['qunitary',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga72528a5e9655482cdf6766aea985b781',1,'cv::ximgproc::qunitary()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga72528a5e9655482cdf6766aea985b781',1,'qunitary()(Global Namespace)']]], - ['quoted_92',['quoted',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5bff62a35321654424cc1f6df8362cea',1,'std']]], - ['quoted_5fstring_2eh_93',['quoted_string.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00452.html',1,'']]] + ['queue_2eh_84',['queue.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00950.html',1,'']]], + ['quick_20reference_20guide_85',['Quick reference guide',['https://eigen.tuxfamily.org/dox/group__QuickRefPage.html',1,'']]], + ['quick_20reference_20guide_20for_20sparse_20matrices_86',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], + ['quicksort_2eh_87',['quicksort.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00953.html',1,'']]], + ['quicksort_5ftag_88',['quicksort_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09755.html',1,'__gnu_parallel']]], + ['quiet_5fnan_89',['quiet_NaN',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#a4a252b113edcbac0881a4ff30d94b1e1',1,'std::numeric_limits']]], + ['qunitary_90',['qunitary',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga72528a5e9655482cdf6766aea985b781',1,'cv::ximgproc::qunitary()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga72528a5e9655482cdf6766aea985b781',1,'qunitary()(Global Namespace)']]], + ['quoted_91',['quoted',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5bff62a35321654424cc1f6df8362cea',1,'std']]], + ['quoted_5fstring_2eh_92',['quoted_string.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00452.html',1,'']]] ]; diff --git a/search/all_1b.js b/search/all_1b.js index 29b15e71..7a07c41e 100644 --- a/search/all_1b.js +++ b/search/all_1b.js @@ -1,7 +1,7 @@ var searchData= [ - ['r_0',['r',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1datasets_1_1MSM__middleburyObj.html#ac6e479e646f3e3b0babffa0e9225be70',1,'cv::datasets::MSM_middleburyObj::r'],['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a65576ef7daf7c86e056b42b34a80520f',1,'cv::detail::tracked_cv_mat::r'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a6a9a4f76fd04649d4d5fa85f56b3cfae',1,'cv::detail::tracked_cv_umat::r']]], - ['r_1',['R',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#ab1fe6908cde4a9662e20f03e7dfcc272',1,'cv::detail::CameraParams::R'],['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html#a523237291402f020dd17d37e15321c40',1,'cv::face::FacemarkAAM::Config::R']]], + ['r_0',['R',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#ab1fe6908cde4a9662e20f03e7dfcc272',1,'cv::detail::CameraParams::R'],['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html#a523237291402f020dd17d37e15321c40',1,'cv::face::FacemarkAAM::Config::R']]], + ['r_1',['r',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1datasets_1_1MSM__middleburyObj.html#ac6e479e646f3e3b0babffa0e9225be70',1,'cv::datasets::MSM_middleburyObj::r'],['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a65576ef7daf7c86e056b42b34a80520f',1,'cv::detail::tracked_cv_mat::r'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a6a9a4f76fd04649d4d5fa85f56b3cfae',1,'cv::detail::tracked_cv_umat::r']]], ['r_5fkinv_2',['r_kinv',['https://docs.opencv.org/4.2.0/dc/d2c/structcv_1_1detail_1_1ProjectorBase.html#a2f30b2a02c9fddf1bacb47a805b00c82',1,'cv::detail::ProjectorBase']]], ['radial_5fvariance_5fhash_2ehpp_3',['radial_variance_hash.hpp',['https://docs.opencv.org/4.2.0/d2/d76/radial__variance__hash_8hpp.html',1,'']]], ['radialvariancehash_4',['RadialVarianceHash',['https://docs.opencv.org/4.2.0/d5/d97/classcv_1_1img__hash_1_1RadialVarianceHash.html',1,'cv::img_hash::RadialVarianceHash'],['https://docs.opencv.org/4.2.0/d5/d97/classcv_1_1img__hash_1_1RadialVarianceHash.html#a6d4f61e91f813a42916e66ebf9f7f4bb',1,'cv::img_hash::RadialVarianceHash::RadialVarianceHash()']]], @@ -17,9 +17,9 @@ var searchData= ['radix_14',['radix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#af69d3e469fe6b7e0de143494703ab04a',1,'std::__numeric_limits_base::radix'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#af69d3e469fe6b7e0de143494703ab04a',1,'std::numeric_limits::radix']]], ['raiihelper_15',['RAIIHelper',['../classutil_1_1RAIIHelper.html',1,'util::RAIIHelper'],['../classutil_1_1RAIIHelper.html#a319819be0066e81cf1e89762676b4130',1,'util::RAIIHelper::RAIIHelper(const std::function< void()> &f)'],['../classutil_1_1RAIIHelper.html#a87d7a2d46207f257adebfd8f31b3101f',1,'util::RAIIHelper::RAIIHelper(RAIIHelper &&other)']]], ['randmvnormal_16',['randMVNormal',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gaf444266b05eeb29f24fc4fe6b6972c8d',1,'cv::ml::randMVNormal()'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gaf444266b05eeb29f24fc4fe6b6972c8d',1,'randMVNormal()(Global Namespace)']]], - ['randn_17',['randn',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'cv::Matx::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< _Tp, cn, 1 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, 1, 3 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, 2, 2 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, 2, 3 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, 3, 3 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, 3, 4 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, 4, 4 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, cn, 1 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< float, 2, 3 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< float, 3, 3 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< float, cn, 1 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< float_type, 4, 4 >::randn()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaeff1f61e972d133a04ce3a5f81cf6808',1,'cv::randn()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaeff1f61e972d133a04ce3a5f81cf6808',1,'randn(InputOutputArray dst, InputArray mean, InputArray stddev)(Global Namespace)']]], - ['random_18',['random',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00122.html',1,'']]], - ['random_19',['Random',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae814abb451b48ed872819192dc188c19',1,'Eigen::DenseBase::Random()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae97f8d9d08f969c733c8144be6225756',1,'Eigen::DenseBase::Random(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7eb5f974a8f0b67eac7080db1da0e308',1,'Eigen::DenseBase::Random(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae814abb451b48ed872819192dc188c19',1,'DenseBase< ArrayWrapper< ExpressionType > >::Random()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae97f8d9d08f969c733c8144be6225756',1,'DenseBase< ArrayWrapper< ExpressionType > >::Random(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7eb5f974a8f0b67eac7080db1da0e308',1,'DenseBase< ArrayWrapper< ExpressionType > >::Random(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae814abb451b48ed872819192dc188c19',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Random()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae97f8d9d08f969c733c8144be6225756',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Random(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7eb5f974a8f0b67eac7080db1da0e308',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Random(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae814abb451b48ed872819192dc188c19',1,'DenseBase< Solve< Decomposition, RhsType > >::Random()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae97f8d9d08f969c733c8144be6225756',1,'DenseBase< Solve< Decomposition, RhsType > >::Random(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7eb5f974a8f0b67eac7080db1da0e308',1,'DenseBase< Solve< Decomposition, RhsType > >::Random(Index size)']]], + ['randn_17',['randn',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'cv::Matx::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< _Tp, cn, 1 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, 1, 3 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, 2, 2 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, 2, 3 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, 3, 3 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, 3, 4 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, 4, 4 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< double, cn, 1 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< float, 2, 3 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< float, 3, 3 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< float, cn, 1 >::randn()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a11190acab093fb84483a90f3da059ca0',1,'Matx< float_type, 4, 4 >::randn()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaeff1f61e972d133a04ce3a5f81cf6808',1,'cv::randn()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaeff1f61e972d133a04ce3a5f81cf6808',1,'randn()(Global Namespace)']]], + ['random_18',['Random',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae814abb451b48ed872819192dc188c19',1,'Eigen::DenseBase::Random()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae97f8d9d08f969c733c8144be6225756',1,'Eigen::DenseBase::Random(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7eb5f974a8f0b67eac7080db1da0e308',1,'Eigen::DenseBase::Random(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae814abb451b48ed872819192dc188c19',1,'DenseBase< ArrayWrapper< ExpressionType > >::Random()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae97f8d9d08f969c733c8144be6225756',1,'DenseBase< ArrayWrapper< ExpressionType > >::Random(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7eb5f974a8f0b67eac7080db1da0e308',1,'DenseBase< ArrayWrapper< ExpressionType > >::Random(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae814abb451b48ed872819192dc188c19',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Random()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae97f8d9d08f969c733c8144be6225756',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Random(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7eb5f974a8f0b67eac7080db1da0e308',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Random(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae814abb451b48ed872819192dc188c19',1,'DenseBase< Solve< Decomposition, RhsType > >::Random()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae97f8d9d08f969c733c8144be6225756',1,'DenseBase< Solve< Decomposition, RhsType > >::Random(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7eb5f974a8f0b67eac7080db1da0e308',1,'DenseBase< Solve< Decomposition, RhsType > >::Random(Index size)']]], + ['random_19',['random',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00122.html',1,'']]], ['random_20generator_20and_20text_20with_20opencv_20',['Random generator and text with OpenCV',['https://docs.opencv.org/4.2.0/df/d61/tutorial_random_generator_and_text.html',1,'']]], ['random_20number_20distributions_21',['Random Number Distributions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01542.html',1,'']]], ['random_20number_20generation_22',['Random Number Generation',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01500.html',1,'']]], @@ -62,706 +62,701 @@ var searchData= ['rank_59',['rank',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03875.html',1,'std::rank< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a2a59aaa689613ce5ef0c9130ad33940e',1,'Eigen::ColPivHouseholderQR::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a2a59aaa689613ce5ef0c9130ad33940e',1,'ColPivHouseholderQR< MatrixType >::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#af348f64b26f8467a020062c22b748806',1,'Eigen::CompleteOrthogonalDecomposition::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aeae555220f46477818ccc94aca2de770',1,'Eigen::FullPivHouseholderQR::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a67a870aa69e699e058d04802ba0bdad9',1,'Eigen::FullPivLU::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a30b89e24f42f1692079eea31b361d26a',1,'Eigen::JacobiSVD::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a4ae2c5bdaa3c18ae5a364f65030722c3',1,'Eigen::SparseQR::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a66382a71d51b09a8526268467156fbc3',1,'Eigen::SPQR::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a30b89e24f42f1692079eea31b361d26a',1,'Eigen::SVDBase::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a30b89e24f42f1692079eea31b361d26a',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::rank()']]], ['rankupdate_60',['rankUpdate',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a858dc77b65dd48248299bb6a6a758abf',1,'Eigen::LDLT::rankUpdate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a8ce93e407a2ba75489bcb6e89ea4c153',1,'Eigen::LLT::rankUpdate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a1b5afab9f9df919cba99d8ed1a260567',1,'Eigen::SelfAdjointView::rankUpdate(const MatrixBase< DerivedU > &u, const MatrixBase< DerivedV > &v, const Scalar &alpha=Scalar(1))'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#acc37b0437e0eee05f861bce511df9c77',1,'Eigen::SelfAdjointView::rankUpdate(const MatrixBase< DerivedU > &u, const Scalar &alpha=Scalar(1))'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a1b5afab9f9df919cba99d8ed1a260567',1,'SelfAdjointView< const Derived, UpLo >::rankUpdate(const MatrixBase< DerivedU > &u, const MatrixBase< DerivedV > &v, const Scalar &alpha=Scalar(1))'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#acc37b0437e0eee05f861bce511df9c77',1,'SelfAdjointView< const Derived, UpLo >::rankUpdate(const MatrixBase< DerivedU > &u, const Scalar &alpha=Scalar(1))'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#abe66734215f8d8220be0985d67901021',1,'Eigen::SparseSelfAdjointView::rankUpdate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#abe66734215f8d8220be0985d67901021',1,'SparseSelfAdjointView< const Derived, UpLo >::rankUpdate()']]], ['ransac_61',['RANSAC',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggaaedb1f94e6b143cef163622c531afd88a724159df258a5d7e29410a6a2f4e6c87',1,'cv::RANSAC'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggaaedb1f94e6b143cef163622c531afd88a724159df258a5d7e29410a6a2f4e6c87',1,'RANSAC(Global Namespace)']]], - ['ransacparams_62',['RansacParams',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html',1,'cv::videostab']]], + ['ransacparams_62',['RansacParams',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html',1,'cv::videostab::RansacParams'],['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#aade72367fb9106951e3993109fb60900',1,'cv::videostab::RansacParams::RansacParams()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga0f1dea7ffe8b8d5953f3f6e50e87dde4',1,'cv::videostab::RansacParams::RansacParams(int size, float thresh, float eps, float prob)'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga0f1dea7ffe8b8d5953f3f6e50e87dde4',1,'RansacParams()(Global Namespace)']]], ['ransacparams_63',['ransacParams',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#a093c536a88dacdb31f7f4deddf20a68a',1,'cv::videostab::MotionEstimatorRansacL2::ransacParams()'],['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a2b456654d89323abcff87d5fcfed9b4a',1,'cv::videostab::TranslationBasedLocalOutlierRejector::ransacParams()']]], - ['ransacparams_64',['RansacParams',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#aade72367fb9106951e3993109fb60900',1,'cv::videostab::RansacParams::RansacParams()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga0f1dea7ffe8b8d5953f3f6e50e87dde4',1,'cv::videostab::RansacParams::RansacParams(int size, float thresh, float eps, float prob)'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga0f1dea7ffe8b8d5953f3f6e50e87dde4',1,'RansacParams()(Global Namespace)']]], - ['raspberry_65',['raspberry',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a114fc719412ae919877cce3c65c03a1b',1,'cv::viz::Color']]], - ['raster_20files_20with_20gdal_66',['Reading Geospatial Raster files with GDAL',['https://docs.opencv.org/4.2.0/d7/d73/tutorial_raster_io_gdal.html',1,'']]], - ['raster_5fio_5fgdal_2emarkdown_67',['raster_io_gdal.markdown',['https://docs.opencv.org/4.2.0/d5/d67/raster__io__gdal_8markdown.html',1,'']]], - ['ratio_68',['ratio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02711.html',1,'std::ratio< _Num, _Den >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00125.html',1,'(Global Namespace)']]], - ['ratio_5fdivide_69',['ratio_divide',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html#gab89b6a439b3582240985f372bc381666',1,'std::ratio_divide'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html#gab89b6a439b3582240985f372bc381666',1,'ratio_divide(Global Namespace)']]], - ['ratio_5fequal_70',['ratio_equal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02723.html',1,'std']]], - ['ratio_5fmultiply_71',['ratio_multiply',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html#gaa0eb766f5844bb5f3ccbeaae9b994257',1,'std::ratio_multiply'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html#gaa0eb766f5844bb5f3ccbeaae9b994257',1,'ratio_multiply(Global Namespace)']]], - ['ratio_5fnot_5fequal_72',['ratio_not_equal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02727.html',1,'std']]], - ['rational_20arithmetic_73',['Rational Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html',1,'']]], - ['raw_20buffers_3a_20the_20map_20class_74',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], - ['raw_5fmoments_75',['raw_moments',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#aeb40fa3150e2408be0f98e3b541948b4',1,'cv::text::ERStat']]], - ['raw_5foutput_76',['RAW_OUTPUT',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af1ea864e1c19796e6264ebb3950c0b9aa639a8ea2b61c2bf03f87cf4c4a5bd824',1,'cv::ml::StatModel']]], - ['raw_5fstorage_5fiterator_77',['raw_storage_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07823.html',1,'std']]], - ['rawin_78',['rawIn',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a4d935052325c9b3a795e5b63090bfe34',1,'cv::_InputArray::rawIn(const std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a57e89a801d76b4fc28b6f0986eb5e88c',1,'cv::_InputArray::rawIn(const std::array< _Tp, _Nm > &arr)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga357a0ae6f9a5951b70fa50ec304d4025',1,'cv::rawIn()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga357a0ae6f9a5951b70fa50ec304d4025',1,'rawIn()(Global Namespace)']]], - ['rawinout_79',['rawInOut',['https://docs.opencv.org/4.2.0/d0/d46/classcv_1_1__InputOutputArray.html#a556d01ad941ab25392981bd72f317813',1,'cv::_InputOutputArray::rawInOut(std::array< _Tp, _Nm > &arr)'],['https://docs.opencv.org/4.2.0/d0/d46/classcv_1_1__InputOutputArray.html#acaf3105a0b692f1167946d50016229c3',1,'cv::_InputOutputArray::rawInOut(std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0a6668770210aac2bab60edef7665338',1,'cv::rawInOut()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0a6668770210aac2bab60edef7665338',1,'rawInOut()(Global Namespace)']]], - ['rawout_80',['rawOut',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a21f3068ffe2bbf6ccdba4c43accec540',1,'cv::_OutputArray::rawOut(std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a10d4780986585b8a3dd6329ffb68af27',1,'cv::_OutputArray::rawOut(std::array< _Tp, _Nm > &arr)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga810a6d3d2b66b6d04e9f07e567b77407',1,'cv::rawOut()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga810a6d3d2b66b6d04e9f07e567b77407',1,'rawOut()(Global Namespace)']]], - ['rawsize_81',['rawSize',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7ddda6e2aa1c1c6c08e89db3d9afe9d0',1,'cv::FileNode']]], - ['rawvideosource_82',['RawVideoSource',['https://docs.opencv.org/4.2.0/d6/d55/classcv_1_1cudacodec_1_1RawVideoSource.html',1,'cv::cudacodec']]], - ['raycast_5fstep_5ffactor_83',['raycast_step_factor',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a240c7c3f984f60b0e11c42c42f8a673e',1,'cv::dynafu::Params::raycast_step_factor'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#afa2ee461b3c112dfe6f536b200957b6e',1,'cv::kinfu::Params::raycast_step_factor']]], - ['rb_5ftree_84',['rb_tree',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09227.html',1,'__gnu_cxx::rb_tree< class, class, class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00863.html',1,'(Global Namespace)']]], - ['rb_5ftree_5f_2ehpp_85',['rb_tree_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01391.html',1,'']]], - ['rb_5ftree_5fmap_86',['rb_tree_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11975.html',1,'__gnu_pbds::detail']]], - ['rb_5ftree_5fmap_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_87',['rb_tree_map_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16706.html',1,'']]], - ['rb_5ftree_5fmap_5f_2fdebug_5ffn_5fimps_2ehpp_88',['rb_tree_map_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16778.html',1,'']]], - ['rb_5ftree_5fmap_5f_2ferase_5ffn_5fimps_2ehpp_89',['rb_tree_map_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16841.html',1,'']]], - ['rb_5ftree_5fmap_5f_2ffind_5ffn_5fimps_2ehpp_90',['rb_tree_map_/find_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16889.html',1,'']]], - ['rb_5ftree_5fmap_5f_2finfo_5ffn_5fimps_2ehpp_91',['rb_tree_map_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16973.html',1,'']]], - ['rb_5ftree_5fmap_5f_2finsert_5ffn_5fimps_2ehpp_92',['rb_tree_map_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17006.html',1,'']]], - ['rb_5ftree_5fmap_5f_2fnode_2ehpp_93',['rb_tree_map_/node.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17102.html',1,'']]], - ['rb_5ftree_5fmap_5f_2fsplit_5fjoin_5ffn_5fimps_2ehpp_94',['rb_tree_map_/split_join_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17249.html',1,'']]], - ['rb_5ftree_5fmap_5f_2ftraits_2ehpp_95',['rb_tree_map_/traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17318.html',1,'']]], - ['rb_5ftree_5fnode_5f_96',['rb_tree_node_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11967.html',1,'__gnu_pbds::detail']]], - ['rb_5ftree_5ftag_97',['rb_tree_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11243.html',1,'__gnu_pbds']]], - ['rbegin_98',['rbegin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#afafcdd90aee602e7dee77c634b27604d',1,'__gnu_cxx::__versa_string::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a68dfba201272143f3b4bffcd6377b110',1,'__gnu_cxx::__versa_string::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< _CharT >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< _CharT >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< _CharT, _Traits, _Allocator >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< _CharT, _Traits, _Allocator >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< char >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< char >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< char_type, _Traits, _Alloc >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< char_type, _Traits, _Alloc >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< value_type >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< value_type >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a00b51e916472a01d8d68945681ab8245',1,'deque< _StateSeqT >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#af3714db48a222a584264a3e668bd5b3c',1,'deque< _StateSeqT >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8a4cacefc7a58e913f2e9876df0d59de',1,'list< __inp, __rebind_inp >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3ba0b1fa92ccc5268e64c0023632aee7',1,'list< __inp, __rebind_inp >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'match_results< _Bi_iter >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'match_results< _Bi_iter >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'std::basic_string::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'std::basic_string::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a00b51e916472a01d8d68945681ab8245',1,'std::deque::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#af3714db48a222a584264a3e668bd5b3c',1,'std::deque::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8a4cacefc7a58e913f2e9876df0d59de',1,'std::list::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3ba0b1fa92ccc5268e64c0023632aee7',1,'std::list::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a4ca3db2d238641b23001310899d884fb',1,'std::map::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a461fb30e5fd8953549843ff651d06ec8',1,'std::map::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'std::match_results::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'std::match_results::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ab44fe0a492344094f870a3f149d2dad1',1,'std::multimap::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a6fec7115cf9a873709d612aede06d551',1,'std::multimap::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a6b0cbc71ad54db5d009609ec077bc13f',1,'std::multiset::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a9c6f4b02f2ed2c82963fce15fb3d24ee',1,'std::set::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'std::vector::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'std::vector::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< __diff_type >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< __diff_type >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _CharClassT >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _CharClassT >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _CharT >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _CharT >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _Cmpt >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _Cmpt >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _Node *, _Nodeptr_Alloc >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _Node *, _Nodeptr_Alloc >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _RealType >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _RealType >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _State< _TraitsT::char_type > >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _State< _TraitsT::char_type > >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _StringT >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _StringT >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< block_type, allocator_type >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< block_type, allocator_type >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< Catalog_info * >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< Catalog_info * >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< double >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< double >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< int >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< int >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< result_type >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< result_type >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< size_t >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< size_t >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< std::pair< _BiIter, int > >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< std::pair< _BiIter, int > >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< std::pair< _StateIdT, std::vector > >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< std::pair< _StateIdT, std::vector > >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< std::pair< _StrTransT, _StrTransT > >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< std::pair< _StrTransT, _StrTransT > >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< sub_match< _Bi_iter >, _Alloc >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< sub_match< _Bi_iter >, _Alloc >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< sub_match< _BiIter >, _Alloc >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< sub_match< _BiIter >, _Alloc >::rbegin() const noexcept'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'Eigen::VectorwiseOp::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'Eigen::VectorwiseOp::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const Derived, Horizontal >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const Derived, Horizontal >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const Derived, Vertical >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const Derived, Vertical >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::rbegin() const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aff8e38cd973bc94557fa8d36433c0e4c.html#aff8e38cd973bc94557fa8d36433c0e4c',1,'nlohmann::basic_json::rbegin() noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aab1329f44c8301b7679962726a043549.html#aab1329f44c8301b7679962726a043549',1,'nlohmann::basic_json::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae16f6e3954ee80febd7a13ca23c0cb69',1,'std::rbegin(_Container &__cont) -> decltype(__cont.rbegin())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a82b4f328583bc1eacb96e1916d2499a4',1,'std::rbegin(const _Container &__cont) -> decltype(__cont.rbegin())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#adc3d2e80cfd605a4d419e5ea94847f03',1,'std::rbegin(_Tp(&__arr)[_Nm])'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa98b19c718d53cb983cff800ffe2fdaf',1,'std::rbegin(initializer_list< _Tp > __il)']]], - ['rbf_99',['RBF',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56a8e1f51ebeabd14cbd622f0f945831d4c',1,'cv::ml::SVM']]], - ['rc_100',['rc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11987.html',1,'__gnu_pbds::detail']]], - ['rc_2ehpp_101',['rc.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01394.html',1,'']]], - ['rc_3c_20typename_20binomial_5fheap_5fbase_3c_20value_5ftype_2c_20cmp_5ffn_2c_20_5falloc_20_3e_3a_3anode_2c_20_5falloc_20_3e_102',['rc< typename binomial_heap_base< Value_Type, Cmp_Fn, _Alloc >::node, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11987.html',1,'']]], - ['rc_5fbinomial_5fheap_103',['rc_binomial_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11991.html',1,'__gnu_pbds::detail']]], - ['rc_5fbinomial_5fheap_5f_2ehpp_104',['rc_binomial_heap_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01397.html',1,'']]], - ['rc_5fbinomial_5fheap_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_105',['rc_binomial_heap_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16709.html',1,'']]], - ['rc_5fbinomial_5fheap_5f_2fdebug_5ffn_5fimps_2ehpp_106',['rc_binomial_heap_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16781.html',1,'']]], - ['rc_5fbinomial_5fheap_5f_2ferase_5ffn_5fimps_2ehpp_107',['rc_binomial_heap_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16844.html',1,'']]], - ['rc_5fbinomial_5fheap_5f_2finsert_5ffn_5fimps_2ehpp_108',['rc_binomial_heap_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17009.html',1,'']]], - ['rc_5fbinomial_5fheap_5f_2fsplit_5fjoin_5ffn_5fimps_2ehpp_109',['rc_binomial_heap_/split_join_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17252.html',1,'']]], - ['rc_5fbinomial_5fheap_5f_2ftrace_5ffn_5fimps_2ehpp_110',['rc_binomial_heap_/trace_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17300.html',1,'']]], - ['rc_5fbinomial_5fheap_5ftag_111',['rc_binomial_heap_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11279.html',1,'__gnu_pbds']]], - ['rc_5fstring_5fbase_2eh_112',['rc_string_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01076.html',1,'']]], - ['rcond_113',['rcond',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a0bc63f910960dc3e35acecc8442025b6',1,'Eigen::FullPivLU::rcond()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#ae646403fdde3a4b18e278a32c61a0953',1,'Eigen::LDLT::rcond()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a59338fa78db171d02fd5a2c9e4f3a30c',1,'Eigen::LLT::rcond()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a472b46d5d9ff7c328e1dccc13805f690',1,'Eigen::PartialPivLU::rcond()']]], - ['rctype_114',['RCType',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a174458d4987ebe57ec7efa2b8670dd09',1,'cv::cudacodec::EncoderParams']]], - ['rdbuf_115',['rdbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'basic_ios< char, _Traits >::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'basic_ios< char, _Traits >::rdbuf(basic_streambuf< char, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'basic_iostream< char >::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'basic_iostream< char >::rdbuf(basic_streambuf< char, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'basic_istream< char >::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'basic_istream< char >::rdbuf(basic_streambuf< char, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'basic_istream< char, _Traits >::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'basic_istream< char, _Traits >::rdbuf(basic_streambuf< char, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'basic_ostream< char >::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'basic_ostream< char >::rdbuf(basic_streambuf< char, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'basic_ostream< char, _Traits >::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'basic_ostream< char, _Traits >::rdbuf(basic_streambuf< char, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_fstream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02079.html#a7e87dac89bf6608d35890a632336b347',1,'std::basic_fstream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_ifstream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02071.html#a7f104c73e5bd5a76405a0edc299da3e2',1,'std::basic_ifstream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'std::basic_ios::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_ios::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'std::basic_iostream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_iostream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'std::basic_istream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_istream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_istringstream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02471.html#a095330a0443ef6ad188ede768152c6c4',1,'std::basic_istringstream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_ofstream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02075.html#ac507f40924f057de2f2c6ced401e6467',1,'std::basic_ofstream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'std::basic_ostream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_ostream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_ostringstream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02475.html#af8c4c9652fcb9c4e94d86cd8210ee679',1,'std::basic_ostringstream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_stringstream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02479.html#a20c0bfc4dc37364093b8c7bfe77d1d7f',1,'std::basic_stringstream::rdbuf() const']]], - ['rdstate_116',['rdstate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'basic_ios< char, _Traits >::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'basic_iostream< char >::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'basic_istream< char >::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'basic_istream< char, _Traits >::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'basic_ostream< char >::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'basic_ostream< char, _Traits >::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_fstream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_ifstream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_ios::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_iostream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_istream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_istringstream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_ofstream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_ostream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_ostringstream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_stringstream::rdstate()']]], - ['re_117',['re',['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#ac4cd4a983c71a573eaeaa8bbbda02495',1,'cv::Complex']]], - ['read_118',['READ',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482daa0dcc459c4d100c35ccfa9a643827bed',1,'cv::FileStorage']]], - ['read_119',['read',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#aef2ad3f4145bd6e8c3664eb1c4b5e1e6',1,'cv::Algorithm::read(const FileNode &fn)'],['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#ad8c591bacb34c485f5b7a250c314fc53',1,'cv::Algorithm::read(const FileNode &fn)'],['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html#af4ccaaa1001e0c9437b7e969be1cdf7b',1,'cv::face::BasicFaceRecognizer::read()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a9a4c83beabf93afec71cfeb152dffc5a',1,'cv::line_descriptor::BinaryDescriptor::read()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a6e3f096b121259fd3bab1c2437e840c5',1,'cv::CascadeClassifier::read()'],['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a211adc6596382d9848fd379d8a8dedf7',1,'cv::linemod::ColorGradient::read()'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#a0da9168833678341315403044f473404',1,'cv::CvFeatureParams::read()'],['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#a6677fc10517b4d00938f7566af162d3b',1,'cv::CvHaarFeatureParams::read()'],['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html#acca110107f49c38903ead85ab0d9939c',1,'cv::CvParams::read()'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a08ec3f3eecde3c63b677b89bfc12ad69',1,'cv::linemod::DepthNormal::read()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#aba10146926505e6b90377f24489e336c',1,'cv::DescriptorMatcher::read(const String &fileName)'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#abb46ea487ffa0c0f9dd72d3de9fd42ab',1,'cv::DescriptorMatcher::read(const FileNode &) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a6388744994ba8eb20b1d2f105e36e2f1',1,'cv::linemod::Detector::read()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#acc42e5b04595dba71f0777c7179af8c3',1,'cv::face::FaceRecognizer::read(const String &filename)'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#a6ce52a3c8941aaa3cd09c31d6a6ef192',1,'cv::face::FaceRecognizer::read(const FileNode &fn) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d9/db9/structcv_1_1linemod_1_1Feature.html#a8adc04698f0a0f1f4e3b11bfc9b3df92',1,'cv::linemod::Feature::read()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a84382d745ea4b4fee70ed2e665ad1b61',1,'cv::Feature2D::read(const String &fileName)'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a484d5df8a2768a38073c581f056d91d7',1,'cv::Feature2D::read(const FileNode &) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ab24433dde37f770766481a91983e5f44',1,'cv::FileNode::read(const FileNode &node, int &value, int default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a170bdafea987ecb87f36651be1cf8293',1,'cv::FileNode::read(const FileNode &node, float &value, float default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9827a4c7674d30c00dd95099a663c402',1,'cv::FileNode::read(const FileNode &node, double &value, double default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#af37d1783df83ede65e0bff01a2f3f450',1,'cv::FileNode::read(const FileNode &node, std::string &value, const std::string &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a0aaa102983844a5b4a43e12bee7703b3',1,'cv::FileNode::read(const FileNode &node, Mat &mat, const Mat &default_mat=Mat())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa667d34b449dd325150d41ca3cf2294c',1,'cv::FileNode::read(const FileNode &node, SparseMat &mat, const SparseMat &default_mat=SparseMat())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a5159eab4b11bb7e3383c8339c45cd698',1,'cv::FileNode::read(const FileNode &node, KeyPoint &value, const KeyPoint &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9075e2076b2ce3656751d65863c2dc43',1,'cv::FileNode::read(const FileNode &node, DMatch &value, const DMatch &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ac0d9174cb7cdfac05b0daa654d2101d7',1,'cv::FileNode::read(const FileNode &node, Point_< _Tp > &value, const Point_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a543159a22b6e9fb19773696b38ea4189',1,'cv::FileNode::read(const FileNode &node, Point3_< _Tp > &value, const Point3_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a91e5af29534fa39bc1b9ea7d62eb0b66',1,'cv::FileNode::read(const FileNode &node, Size_< _Tp > &value, const Size_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#abf08ccd13398796da79c6fd07cf08d87',1,'cv::FileNode::read(const FileNode &node, Complex< _Tp > &value, const Complex< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae7d745c67c1d944ba3eb1245b6714496',1,'cv::FileNode::read(const FileNode &node, Rect_< _Tp > &value, const Rect_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a399ed562c8178cae18851944d304ed54',1,'cv::FileNode::read(const FileNode &node, Vec< _Tp, cn > &value, const Vec< _Tp, cn > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a6838c55dcea3626add455ce6498fa46e',1,'cv::FileNode::read(const FileNode &node, Matx< _Tp, m, n > &value, const Matx< _Tp, m, n > &default_matx=Matx< _Tp, m, n >())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aada6c34de9b3b1755c217f2ca96051bd',1,'cv::FileNode::read(const FileNode &node, Scalar_< _Tp > &value, const Scalar_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a143b31786d7927e3660ae42fdb258fb2',1,'cv::FileNode::read(const FileNode &node, Range &value, const Range &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae541c479c2833d1cdeea6e80f8faee98',1,'cv::FileNode::read(const FileNode &node, bool &value, bool default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9c9fc5bcbaa3bad151a96e992cdad9a1',1,'cv::FileNode::read(const FileNode &node, uchar &value, uchar default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a8187ea955da47ab2c631c31245320028',1,'cv::FileNode::read(const FileNode &node, schar &value, schar default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a95512c3eba67570b9c1279e6f053972b',1,'cv::FileNode::read(const FileNode &node, ushort &value, ushort default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa9676bab54dc0ad11e3d7142b9a032b3',1,'cv::FileNode::read(const FileNode &node, short &value, short default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#acdd936a4632cc7b4f65836f701e7ccf9',1,'cv::FileNode::read(FileNodeIterator &it, std::vector< _Tp > &vec, size_t maxCount=(size_t) INT_MAX)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7ee12dcc6ea674d1f6a438703d948080',1,'cv::FileNode::read(const FileNode &node, _Tp &value, const _Tp &default_value=static_cast< _Tp >(0))'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a19b13d9369933709af74a8fd3c5e0d15',1,'cv::FileNode::read(const FileNode &node, std::vector< _Tp > &vec, const std::vector< _Tp > &default_value=std::vector< _Tp >())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a75a16693d3fd15f0c6ddab1abd8ce273',1,'cv::FileNode::read(const FileNode &node, std::vector< KeyPoint > &vec, const std::vector< KeyPoint > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a82ddaf6232746691f81f232454d491ae',1,'cv::FileNode::read(const FileNode &node, std::vector< DMatch > &vec, const std::vector< DMatch > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ab24433dde37f770766481a91983e5f44',1,'cv::FileNode::read(const FileNode &node, int &value, int default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a170bdafea987ecb87f36651be1cf8293',1,'cv::FileNode::read(const FileNode &node, float &value, float default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9827a4c7674d30c00dd95099a663c402',1,'cv::FileNode::read(const FileNode &node, double &value, double default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#af37d1783df83ede65e0bff01a2f3f450',1,'cv::FileNode::read(const FileNode &node, std::string &value, const std::string &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a0aaa102983844a5b4a43e12bee7703b3',1,'cv::FileNode::read(const FileNode &node, Mat &mat, const Mat &default_mat=Mat())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa667d34b449dd325150d41ca3cf2294c',1,'cv::FileNode::read(const FileNode &node, SparseMat &mat, const SparseMat &default_mat=SparseMat())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a5159eab4b11bb7e3383c8339c45cd698',1,'cv::FileNode::read(const FileNode &node, KeyPoint &value, const KeyPoint &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9075e2076b2ce3656751d65863c2dc43',1,'cv::FileNode::read(const FileNode &node, DMatch &value, const DMatch &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ac0d9174cb7cdfac05b0daa654d2101d7',1,'cv::FileNode::read(const FileNode &node, Point_< _Tp > &value, const Point_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a543159a22b6e9fb19773696b38ea4189',1,'cv::FileNode::read(const FileNode &node, Point3_< _Tp > &value, const Point3_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a91e5af29534fa39bc1b9ea7d62eb0b66',1,'cv::FileNode::read(const FileNode &node, Size_< _Tp > &value, const Size_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#abf08ccd13398796da79c6fd07cf08d87',1,'cv::FileNode::read(const FileNode &node, Complex< _Tp > &value, const Complex< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae7d745c67c1d944ba3eb1245b6714496',1,'cv::FileNode::read(const FileNode &node, Rect_< _Tp > &value, const Rect_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a399ed562c8178cae18851944d304ed54',1,'cv::FileNode::read(const FileNode &node, Vec< _Tp, cn > &value, const Vec< _Tp, cn > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a6838c55dcea3626add455ce6498fa46e',1,'cv::FileNode::read(const FileNode &node, Matx< _Tp, m, n > &value, const Matx< _Tp, m, n > &default_matx=Matx< _Tp, m, n >())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aada6c34de9b3b1755c217f2ca96051bd',1,'cv::FileNode::read(const FileNode &node, Scalar_< _Tp > &value, const Scalar_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a143b31786d7927e3660ae42fdb258fb2',1,'cv::FileNode::read(const FileNode &node, Range &value, const Range &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae541c479c2833d1cdeea6e80f8faee98',1,'cv::FileNode::read(const FileNode &node, bool &value, bool default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9c9fc5bcbaa3bad151a96e992cdad9a1',1,'cv::FileNode::read(const FileNode &node, uchar &value, uchar default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a8187ea955da47ab2c631c31245320028',1,'cv::FileNode::read(const FileNode &node, schar &value, schar default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a95512c3eba67570b9c1279e6f053972b',1,'cv::FileNode::read(const FileNode &node, ushort &value, ushort default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa9676bab54dc0ad11e3d7142b9a032b3',1,'cv::FileNode::read(const FileNode &node, short &value, short default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#acdd936a4632cc7b4f65836f701e7ccf9',1,'cv::FileNode::read(FileNodeIterator &it, std::vector< _Tp > &vec, size_t maxCount=(size_t) INT_MAX)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7ee12dcc6ea674d1f6a438703d948080',1,'cv::FileNode::read(const FileNode &node, _Tp &value, const _Tp &default_value=static_cast< _Tp >(0))'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a19b13d9369933709af74a8fd3c5e0d15',1,'cv::FileNode::read(const FileNode &node, std::vector< _Tp > &vec, const std::vector< _Tp > &default_value=std::vector< _Tp >())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a75a16693d3fd15f0c6ddab1abd8ce273',1,'cv::FileNode::read(const FileNode &node, std::vector< KeyPoint > &vec, const std::vector< KeyPoint > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a82ddaf6232746691f81f232454d491ae',1,'cv::FileNode::read(const FileNode &node, std::vector< DMatch > &vec, const std::vector< DMatch > &default_value)'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a54caa24612b5b6840c2df65b924a557a',1,'cv::FlannBasedMatcher::read()'],['https://docs.opencv.org/4.2.0/da/dfe/classcv_1_1optflow_1_1GPCForest.html#ad1633ff926fe62db586c652c637db131',1,'cv::optflow::GPCForest::read()'],['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#a68f772c4b664f8de4cf659f1b71350b8',1,'cv::optflow::GPCTree::read()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a237a16a0646dc7a0dbecc52a93480aeb',1,'cv::HOGDescriptor::read()'],['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html#a2d2e8c65f8221a38af040dc1af44cb51',1,'cv::linemod::Modality::read()'],['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#a7cfb0e2099909b0cc2974aac34496b70',1,'cv::saliency::ObjectnessBING::read()'],['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html#ac903f40ca0b2258b539c0558027b426d',1,'cv::TrackerMIL::Params::read()'],['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#a52e884877e62b2f537019ce862def9c9',1,'cv::TrackerBoosting::Params::read()'],['https://docs.opencv.org/4.2.0/d3/dd0/structcv_1_1TrackerTLD_1_1Params.html#a2369615d47bda852ceec6d952bec83c7',1,'cv::TrackerTLD::Params::read()'],['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a4458dfc3b37adf04e2c07faa0987c897',1,'cv::TrackerKCF::Params::read()'],['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1TrackerGOTURN_1_1Params.html#a1fb841b478660ba3891285a69de6c9a3',1,'cv::TrackerGOTURN::Params::read()'],['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a3e7ef254cbdece115ef0f3465f21a2fa',1,'cv::TrackerCSRT::Params::read()'],['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#afa260d0b1970ef58b5054be28fec8ad6',1,'cv::TrackerMedianFlow::Params::read()'],['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#a4e4f1c37a478e954785ca256576c66d4',1,'cv::face::FacemarkAAM::Params::read()'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a3dfa6beeb73d6ee2777628167f7ed160',1,'cv::face::FacemarkLBF::Params::read()'],['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a5793ee4bf7c2aaa460d2ab873a896081',1,'cv::SimpleBlobDetector::Params::read()'],['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#ae3daad9a92b8aedc0c407bdd78232efc',1,'cv::line_descriptor::BinaryDescriptor::Params::read()'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#aa41a4bdd788b67e7e83de8c096f30816',1,'cv::PCA::read()'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a93659b6edcc1c48566e8170d771a097f',1,'cv::ppf_match_3d::PPF3DDetector::read()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#ae77d334f2a53aa913a016b08d67dc16a',1,'cv::ocl::Program::read()'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#acc8d168b3843059d4350b7731b980790',1,'cv::saliency::StaticSaliencySpectralResidual::read()'],['https://docs.opencv.org/4.2.0/d2/dc7/structcv_1_1linemod_1_1Template.html#aa2909fe07944c62dea884d698e5c4839',1,'cv::linemod::Template::read()'],['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a35ef833b72f25af2816ebed38ef1096e',1,'cv::Tracker::read()'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a473055e77dd7faa4d26d686226b292c1',1,'cv::VideoCapture::read()'],['https://docs.opencv.org/4.2.0/de/d0e/classcv_1_1xobjdetect_1_1WBDetector.html#aef2df760f45d25aade518196986e139f',1,'cv::xobjdetect::WBDetector::read()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'basic_iostream< char >::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'basic_iostream< char >::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'basic_istream< char >::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'basic_istream< char >::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'basic_istream< char, _Traits >::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'basic_istream< char, _Traits >::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_fstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_fstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_ifstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_ifstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_iostream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_iostream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_istream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_istream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_istringstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_istringstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_stringstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_stringstream::read(char_type *__s, streamsize __n)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a9afba2f5b9bf298c62da8cf66184e41f',1,'cv::read()'],['../group__camera.html#ga385fcc3b2e88c3692d7be7fb713a809a',1,'cam::read()']]], - ['read_5fonly_120',['READ_ONLY',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a6b2a295dc840db8b6728db2f3a439d6eaf1748d7175ce87c2b5b2be550bb7d4e6',1,'cv::ogl::Buffer::READ_ONLY'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a1010adb068498c191b8079323ad790f9af543648c468a8f8eeab540b84ed9fd2a',1,'cv::ocl::KernelArg::READ_ONLY']]], - ['read_5fonly_5fcache_121',['READ_ONLY_CACHE',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#abd18b22f05533504229e3ee358bb021ea53155ca25411d7e880b55b7114245f03',1,'cv::ocl::Device']]], - ['read_5fwrite_122',['READ_WRITE',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a6b2a295dc840db8b6728db2f3a439d6eaf254a35e198177eff9ecb1992ecf3e26',1,'cv::ogl::Buffer::READ_WRITE'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a1010adb068498c191b8079323ad790f9a7077dbb41d7964d5f68d9e033dcabfa3',1,'cv::ocl::KernelArg::READ_WRITE']]], - ['read_5fwrite_5fattributes_2emarkdown_123',['read_write_attributes.markdown',['https://docs.opencv.org/4.2.0/d9/d65/read__write__attributes_8markdown.html',1,'']]], - ['read_5fwrite_5fcache_124',['READ_WRITE_CACHE',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#abd18b22f05533504229e3ee358bb021ea8928cd5a8ec36e26d1c5239d6bfb2917',1,'cv::ocl::Device']]], - ['readcamera_125',['readCamera',['../namespacerobot.html#a2f3e430760dcde603cf49d380bfe5aba',1,'robot']]], - ['readclass_126',['readClass',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a4fc57692a360b0681e5f4515401c4713',1,'cv::linemod::Detector']]], - ['readclasses_127',['readClasses',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a3783f38548a7650e932240a86c9d3980',1,'cv::linemod::Detector']]], - ['readcloud_128',['readCloud',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga9711c507dba3d8ba11b0c6d845328abc',1,'cv::viz::readCloud()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga9711c507dba3d8ba11b0c6d845328abc',1,'readCloud()(Global Namespace)']]], - ['readconfigfromfile_129',['readConfigFromFile',['../group__camera.html#gab162965d19471ba55dd8126141ed702f',1,'cam']]], - ['readframe_130',['readFrame',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ae98be86ecab179c3862ec3a91c781394',1,'cv::AVIReadContainer']]], - ['readfromfilenode_131',['readFromFileNode',['../classcam_1_1CameraParams.html#a532633c3553a48c668c3f06729a7af70',1,'cam::CameraParams']]], - ['readfrommodeloptimizer_132',['readFromModelOptimizer',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a327720af187378a58e0a48feb0b5ef89',1,'cv::dnn::Net::readFromModelOptimizer(const String &xml, const String &bin)'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a7b162c8978d5b1aab599edbf59e5b79f',1,'cv::dnn::Net::readFromModelOptimizer(const std::vector< uchar > &bufferModelConfig, const std::vector< uchar > &bufferWeights)'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#af1fd3b20f8878e202d41d597b3da15d6',1,'cv::dnn::Net::readFromModelOptimizer(const uchar *bufferModelConfigPtr, size_t bufferModelConfigSize, const uchar *bufferWeightsPtr, size_t bufferWeightsSize)']]], - ['readgps_133',['readGPS',['../namespacerobot.html#a15b5204e1fdb2370d1b7eb627ec13924',1,'robot']]], - ['readgt_134',['readGT',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaabcd737c61fe63766554347f2a1859b9',1,'cv::ximgproc::readGT()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaabcd737c61fe63766554347f2a1859b9',1,'readGT()(Global Namespace)']]], - ['readimu_135',['readIMU',['../namespacerobot.html#a5a626747243a1f2ab9a842dc08399159',1,'robot']]], - ['readimuheading_136',['readIMUHeading',['../namespacerobot.html#aa11e482ffaef27ea65955d70d7eaa6a9',1,'robot']]], - ['reading_20and_20writing_137',['Image file reading and writing',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html',1,'']]], - ['reading_20and_20writing_20attributes_138',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]], - ['reading_20datasets_139',['Creating, Writing and Reading Datasets',['https://docs.opencv.org/4.2.0/d4/d93/tutorial_hdf_create_read_write_datasets.html',1,'']]], - ['reading_20geospatial_20raster_20files_20with_20gdal_140',['Reading Geospatial Raster files with GDAL',['https://docs.opencv.org/4.2.0/d7/d73/tutorial_raster_io_gdal.html',1,'']]], - ['readlandmarks_141',['readLandmarks',['../namespacerobot.html#acdba67256ee6b98d21f683ecf1acc9f0',1,'robot']]], - ['readme_2emd_142',['README.md',['https://docs.opencv.org/4.2.0/da/ddd/README_8md.html',1,'']]], - ['readmesh_143',['readMesh',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga2a9275114ec9184bb1814a29ffe00c62',1,'cv::viz::readMesh()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga2a9275114ec9184bb1814a29ffe00c62',1,'readMesh()(Global Namespace)']]], - ['readmodel_144',['readModel',['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1dnn__superres_1_1DnnSuperResImpl.html#aa4b84bf017d92ace7745bcd0c01e225a',1,'cv::dnn_superres::DnnSuperResImpl::readModel(const std::string &path)'],['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1dnn__superres_1_1DnnSuperResImpl.html#a2976d9f1eac620cb8940aa3acd65c06e',1,'cv::dnn_superres::DnnSuperResImpl::readModel(const std::string &weights, const std::string &definition)']]], - ['readnet_145',['readNet',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga3b34fe7a29494a6a4295c169a7d32422',1,'cv::dnn::readNet(const String &model, const String &config="", const String &framework="")'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga138439da76f26266fdefec9723f6c5cd',1,'cv::dnn::readNet(const String &framework, const std::vector< uchar > &bufferModel, const std::vector< uchar > &bufferConfig=std::vector< uchar >())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga3b34fe7a29494a6a4295c169a7d32422',1,'readNet(const String &model, const String &config="", const String &framework="")(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga138439da76f26266fdefec9723f6c5cd',1,'readNet(const String &framework, const std::vector< uchar > &bufferModel, const std::vector< uchar > &bufferConfig=std::vector< uchar >())(Global Namespace)']]], - ['readnetfromcaffe_146',['readNetFromCaffe',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga29d0ea5e52b1d1a6c2681e3f7d68473a',1,'cv::dnn::readNetFromCaffe(const String &prototxt, const String &caffeModel=String())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga5b1fd56ca658f10c3bd544ea46f57164',1,'cv::dnn::readNetFromCaffe(const std::vector< uchar > &bufferProto, const std::vector< uchar > &bufferModel=std::vector< uchar >())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga946b342af1355185a7107640f868b64a',1,'cv::dnn::readNetFromCaffe(const char *bufferProto, size_t lenProto, const char *bufferModel=NULL, size_t lenModel=0)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga29d0ea5e52b1d1a6c2681e3f7d68473a',1,'readNetFromCaffe(const String &prototxt, const String &caffeModel=String())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga5b1fd56ca658f10c3bd544ea46f57164',1,'readNetFromCaffe(const std::vector< uchar > &bufferProto, const std::vector< uchar > &bufferModel=std::vector< uchar >())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga946b342af1355185a7107640f868b64a',1,'readNetFromCaffe(const char *bufferProto, size_t lenProto, const char *bufferModel=NULL, size_t lenModel=0)(Global Namespace)']]], - ['readnetfromdarknet_147',['readNetFromDarknet',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gafde362956af949cce087f3f25c6aff0d',1,'cv::dnn::readNetFromDarknet(const String &cfgFile, const String &darknetModel=String())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gaef8ac647296804e79d463d0e14af8e9d',1,'cv::dnn::readNetFromDarknet(const std::vector< uchar > &bufferCfg, const std::vector< uchar > &bufferModel=std::vector< uchar >())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga351c327837e9e2d98035487695f74836',1,'cv::dnn::readNetFromDarknet(const char *bufferCfg, size_t lenCfg, const char *bufferModel=NULL, size_t lenModel=0)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gafde362956af949cce087f3f25c6aff0d',1,'readNetFromDarknet(const String &cfgFile, const String &darknetModel=String())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gaef8ac647296804e79d463d0e14af8e9d',1,'readNetFromDarknet(const std::vector< uchar > &bufferCfg, const std::vector< uchar > &bufferModel=std::vector< uchar >())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga351c327837e9e2d98035487695f74836',1,'readNetFromDarknet(const char *bufferCfg, size_t lenCfg, const char *bufferModel=NULL, size_t lenModel=0)(Global Namespace)']]], - ['readnetfrommodeloptimizer_148',['readNetFromModelOptimizer',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga4f3b552113d2bff48a54e168791c448e',1,'cv::dnn::readNetFromModelOptimizer(const String &xml, const String &bin)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gac3e76ebe0ac85f45144823be699c2023',1,'cv::dnn::readNetFromModelOptimizer(const std::vector< uchar > &bufferModelConfig, const std::vector< uchar > &bufferWeights)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gad2c5afab20a751d5ac2a587d607023d0',1,'cv::dnn::readNetFromModelOptimizer(const uchar *bufferModelConfigPtr, size_t bufferModelConfigSize, const uchar *bufferWeightsPtr, size_t bufferWeightsSize)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga4f3b552113d2bff48a54e168791c448e',1,'readNetFromModelOptimizer(const String &xml, const String &bin)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gac3e76ebe0ac85f45144823be699c2023',1,'readNetFromModelOptimizer(const std::vector< uchar > &bufferModelConfig, const std::vector< uchar > &bufferWeights)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gad2c5afab20a751d5ac2a587d607023d0',1,'readNetFromModelOptimizer(const uchar *bufferModelConfigPtr, size_t bufferModelConfigSize, const uchar *bufferWeightsPtr, size_t bufferWeightsSize)(Global Namespace)']]], - ['readnetfromonnx_149',['readNetFromONNX',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga7faea56041d10c71dbbd6746ca854197',1,'cv::dnn::readNetFromONNX(const String &onnxFile)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga9198ecaac7c32ddf0aa7a1bcbd359567',1,'cv::dnn::readNetFromONNX(const char *buffer, size_t sizeBuffer)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gac1a00e8bae54070e5837c15b1482997d',1,'cv::dnn::readNetFromONNX(const std::vector< uchar > &buffer)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga7faea56041d10c71dbbd6746ca854197',1,'readNetFromONNX(const String &onnxFile)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga9198ecaac7c32ddf0aa7a1bcbd359567',1,'readNetFromONNX(const char *buffer, size_t sizeBuffer)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gac1a00e8bae54070e5837c15b1482997d',1,'readNetFromONNX(const std::vector< uchar > &buffer)(Global Namespace)']]], - ['readnetfromtensorflow_150',['readNetFromTensorflow',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gad820b280978d06773234ba6841e77e8d',1,'cv::dnn::readNetFromTensorflow(const String &model, const String &config=String())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gac9b3890caab2f84790a17b306f36bd57',1,'cv::dnn::readNetFromTensorflow(const std::vector< uchar > &bufferModel, const std::vector< uchar > &bufferConfig=std::vector< uchar >())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gacdba30a7c20db2788efbf5bb16a7884d',1,'cv::dnn::readNetFromTensorflow(const char *bufferModel, size_t lenModel, const char *bufferConfig=NULL, size_t lenConfig=0)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gad820b280978d06773234ba6841e77e8d',1,'readNetFromTensorflow(const String &model, const String &config=String())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gac9b3890caab2f84790a17b306f36bd57',1,'readNetFromTensorflow(const std::vector< uchar > &bufferModel, const std::vector< uchar > &bufferConfig=std::vector< uchar >())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gacdba30a7c20db2788efbf5bb16a7884d',1,'readNetFromTensorflow(const char *bufferModel, size_t lenModel, const char *bufferConfig=NULL, size_t lenConfig=0)(Global Namespace)']]], - ['readnetfromtorch_151',['readNetFromTorch',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga65a1da76cb7d6852bdf7abbd96f19084',1,'cv::dnn::readNetFromTorch()'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga65a1da76cb7d6852bdf7abbd96f19084',1,'readNetFromTorch()(Global Namespace)']]], - ['readonly_152',['ReadOnly',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a68b572e76caf0ba28d0f964e0d7b8f72',1,'cv::ocl::KernelArg']]], - ['readonlyaccessors_153',['ReadOnlyAccessors',['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5daa1f2b0e6a668b11f2958940965d2b572',1,'Eigen::ReadOnlyAccessors'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5daa1f2b0e6a668b11f2958940965d2b572',1,'ReadOnlyAccessors(Global Namespace)']]], - ['readonlynosize_154',['ReadOnlyNoSize',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a221bd893d50d9d0ec9b0b9e4eb3bb78e',1,'cv::ocl::KernelArg']]], - ['readopticalflow_155',['readOpticalFlow',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga957e09bfbb6c68af6d5a6c1b3312bf88',1,'cv::readOpticalFlow()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga957e09bfbb6c68af6d5a6c1b3312bf88',1,'readOpticalFlow()(Global Namespace)']]], - ['readpose_156',['readPose',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a2f939f6d87d559013d0a3d0ee02ede2a',1,'cv::ppf_match_3d::Pose3D::readPose(FILE *f)'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#ada48c63e8acabc8f2595f33de882b6cc',1,'cv::ppf_match_3d::Pose3D::readPose(const std::string &FileName)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gabaecbbd7c3d7208913394637f6dcd04a',1,'cv::viz::readPose()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gabaecbbd7c3d7208913394637f6dcd04a',1,'readPose()(Global Namespace)']]], - ['readposecluster_157',['readPoseCluster',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a096fbcd0d267046e291c1519c96a30f8',1,'cv::ppf_match_3d::PoseCluster3D::readPoseCluster(FILE *f)'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#aeb6137231fb62e3e3db11c17b5f720b9',1,'cv::ppf_match_3d::PoseCluster3D::readPoseCluster(const std::string &FileName)']]], - ['readraw_158',['readRaw',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a8c491ab24daea27a82a3b64b8b3b85a2',1,'cv::FileNode::readRaw()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#af355d7976305ca2784952a69b9af9b06',1,'cv::FileNodeIterator::readRaw()']]], - ['readsome_159',['readsome',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'basic_iostream< char >::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'basic_iostream< char >::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'basic_istream< char >::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'basic_istream< char >::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'basic_istream< char, _Traits >::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'basic_istream< char, _Traits >::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_fstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_fstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_ifstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_ifstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_iostream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_iostream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_istream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_istream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_istringstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_istringstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_stringstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_stringstream::readsome(char_type *__s, streamsize __n)']]], - ['readtensorfromonnx_160',['readTensorFromONNX',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga8fe873b1b4746c3ceee80bebb16605d5',1,'cv::dnn::readTensorFromONNX()'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga8fe873b1b4746c3ceee80bebb16605d5',1,'readTensorFromONNX()(Global Namespace)']]], - ['readtorchblob_161',['readTorchBlob',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga70a86067eed7e495865cedc175ddba09',1,'cv::dnn::readTorchBlob()'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga70a86067eed7e495865cedc175ddba09',1,'readTorchBlob()(Global Namespace)']]], - ['readtrajectory_162',['readTrajectory',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga8b1eae0484d3d1cef27e3e8fa83aafd2',1,'cv::viz::readTrajectory()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga8b1eae0484d3d1cef27e3e8fa83aafd2',1,'readTrajectory()(Global Namespace)']]], - ['readwrite_163',['ReadWrite',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#aa169a58e85125b20514623871644be24',1,'cv::ocl::KernelArg']]], - ['readwritenosize_164',['ReadWriteNoSize',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a18172f202deb28c75eda860c6e93ce26',1,'cv::ocl::KernelArg']]], - ['ready_165',['ready',['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#aa2a0d471bf2aeab8e665efbfefd6446f',1,'cv::gapi::fluid::View::ready()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ab652f4a3bddd01d0c6f88246ea210eb2',1,'match_results< _Bi_iter >::ready()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ab652f4a3bddd01d0c6f88246ea210eb2',1,'std::match_results::ready()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4ab2fdab230a2c39f3595a947861863cb7',1,'ready(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4ab2fdab230a2c39f3595a947861863cb7',1,'ready(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4ab2fdab230a2c39f3595a947861863cb7',1,'ready(Global Namespace)']]], - ['real_166',['REAL',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a22a5db4ceb750ca68782ddb32f44562fa0643d2e20c5cb3a4120349e069db7232',1,'cv::ml::Boost::REAL'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a6742683e1af0c25240191f756e278c29',1,'cv::FileNode::REAL']]], - ['real_167',['real',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae46beda960c10cd574302b3bec63849c',1,'cv::FileNode::real()'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ac74dc920119b1eba45e9218d9f402afc',1,'Eigen::real()']]], - ['real_168',['REAL',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa8cf125b0e31559ba75a9d9b4f818a554',1,'REAL(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa8cf125b0e31559ba75a9d9b4f818a554',1,'REAL(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa8cf125b0e31559ba75a9d9b4f818a554',1,'REAL(Global Namespace)']]], - ['real_20time_20pose_20estimation_20of_20a_20textured_20object_169',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], - ['real_20world_20vision_170',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], - ['real_5ftime_5fpose_2emarkdown_171',['real_time_pose.markdown',['https://docs.opencv.org/4.2.0/dc/d83/real__time__pose_8markdown.html',1,'']]], - ['realqz_172',['RealQZ',['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html',1,'Eigen::RealQZ< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ac6e41c839f8dae31c9a3906ea7540119',1,'Eigen::RealQZ::RealQZ(const MatrixType &A, const MatrixType &B, bool computeQZ=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ad8fb9235870a8361a2fdd8dcc2e80d01',1,'Eigen::RealQZ::RealQZ(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ac6e41c839f8dae31c9a3906ea7540119',1,'RealQZ< MatrixType >::RealQZ(const MatrixType &A, const MatrixType &B, bool computeQZ=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ad8fb9235870a8361a2fdd8dcc2e80d01',1,'RealQZ< MatrixType >::RealQZ(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)']]], - ['realqz_3c_20matrixtype_20_3e_173',['RealQZ< MatrixType >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html',1,'']]], - ['realscalar_174',['RealScalar',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a5dae5f422a3c71060e6bd31332bf64fd',1,'Eigen::SelfAdjointEigenSolver::RealScalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af9f0234ebeae4c4ca512bcd5fb5e8bb1',1,'Eigen::SelfAdjointView::RealScalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af9f0234ebeae4c4ca512bcd5fb5e8bb1',1,'SelfAdjointView< const Derived, UpLo >::RealScalar']]], - ['realschur_175',['RealSchur',['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html',1,'Eigen::RealSchur< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#afef4d3dc5a493aca2760c20b34337016',1,'Eigen::RealSchur::RealSchur(const EigenBase< InputType > &matrix, bool computeU=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a826c83e2f1d4c8332606a14ea121ff5f',1,'Eigen::RealSchur::RealSchur(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#afef4d3dc5a493aca2760c20b34337016',1,'RealSchur< MatrixType >::RealSchur(const EigenBase< InputType > &matrix, bool computeU=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a826c83e2f1d4c8332606a14ea121ff5f',1,'RealSchur< MatrixType >::RealSchur(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)']]], - ['realschur_3c_20matrixtype_20_3e_176',['RealSchur< MatrixType >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html',1,'']]], - ['realvectortype_177',['RealVectorType',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#acd090d5fdfc3cc017a13b6d8daa92287',1,'Eigen::SelfAdjointEigenSolver']]], - ['rebind_178',['rebind',['https://docs.opencv.org/4.2.0/da/d52/classcv_1_1Allocator_1_1rebind.html',1,'cv::Allocator< class >::rebind'],['https://docs.opencv.org/4.2.0/d3/dd1/structcv_1_1cudev_1_1Avg_1_1rebind.html',1,'cv::cudev::Avg< class >::rebind'],['https://docs.opencv.org/4.2.0/d1/d7c/structcv_1_1cudev_1_1Max_1_1rebind.html',1,'cv::cudev::Max< class >::rebind'],['https://docs.opencv.org/4.2.0/d2/dff/structcv_1_1cudev_1_1Min_1_1rebind.html',1,'cv::cudev::Min< class >::rebind'],['https://docs.opencv.org/4.2.0/d1/d1d/structcv_1_1cudev_1_1Sum_1_1rebind.html',1,'cv::cudev::Sum::rebind< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06311.html#a623750ac65e5d54fc26075bc69af6081',1,'std::pointer_traits::rebind']]], - ['recentedge_179',['recentEdge',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a80cd8452cf0a0eb8fab9a6875a1bbd0f',1,'cv::Subdiv2D']]], - ['recip16s_180',['recip16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga772bb1fa1685d71849f79082a80fcc31',1,'cv::hal::recip16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga772bb1fa1685d71849f79082a80fcc31',1,'recip16s()(Global Namespace)']]], - ['recip16u_181',['recip16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8445f61e2f091b105828e8545478af6d',1,'cv::hal::recip16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8445f61e2f091b105828e8545478af6d',1,'recip16u()(Global Namespace)']]], - ['recip32f_182',['recip32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5b71f0bb6c0b759161073c2f7912d711',1,'cv::hal::recip32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5b71f0bb6c0b759161073c2f7912d711',1,'recip32f()(Global Namespace)']]], - ['recip32s_183',['recip32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9ec38966b1ad5b1e6310f072e9b9f88d',1,'cv::hal::recip32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9ec38966b1ad5b1e6310f072e9b9f88d',1,'recip32s()(Global Namespace)']]], - ['recip64f_184',['recip64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae19484a785495245c58d751824d9eb0f',1,'cv::hal::recip64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae19484a785495245c58d751824d9eb0f',1,'recip64f()(Global Namespace)']]], - ['recip8s_185',['recip8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga98afc67712c4d56b8c51e3c43d902e42',1,'cv::hal::recip8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga98afc67712c4d56b8c51e3c43d902e42',1,'recip8s()(Global Namespace)']]], - ['recip8u_186',['recip8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8c0cef82dafa61a600048b2ad488beba',1,'cv::hal::recip8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8c0cef82dafa61a600048b2ad488beba',1,'recip8u(const uchar *, size_t, const uchar *src2, size_t step2, uchar *dst, size_t step, int width, int height, void *scale)(Global Namespace)']]], - ['reciprocial_187',['Element-wise reciprocial',['https://docs.opencv.org/4.2.0/d4/de4/group__core__hal__interface__reciprocial.html',1,'']]], - ['recognition_188',['Recognition',['https://docs.opencv.org/4.2.0/d4/d8b/group__datasets__ar.html',1,'Action Recognition'],['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html',1,'Face Recognition'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html',1,'Gesture Recognition'],['https://docs.opencv.org/4.2.0/dc/d24/group__datasets__or.html',1,'Object Recognition'],['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'Scene Text Detection and Recognition'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html',1,'Scene Text Recognition'],['https://docs.opencv.org/4.2.0/db/d7b/group__datasets__tr.html',1,'Text Recognition']]], - ['recognition_20and_20pose_20estimation_20api_189',['3D object recognition and pose estimation API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'']]], - ['recognition_20with_20opencv_190',['Face Recognition with OpenCV',['https://docs.opencv.org/4.2.0/da/d60/tutorial_face_main.html',1,'']]], - ['reconstruct_191',['reconstruct',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a64eb8bb493d5c491e6d28ea04501c068',1,'cv::LDA::reconstruct()'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#ga279c084302ae1d7541d458e4b23fabd3',1,'cv::sfm::reconstruct(InputArrayOfArrays points2d, OutputArray Ps, OutputArray points3d, InputOutputArray K, bool is_projective=false)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#gaadb8cc60069485cbb9273b1efebd757d',1,'cv::sfm::reconstruct(InputArrayOfArrays points2d, OutputArray Rs, OutputArray Ts, InputOutputArray K, OutputArray points3d, bool is_projective=false)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#ga2d2661dc124447c3ff1c589eb8354768',1,'cv::sfm::reconstruct(const std::vector< String > images, OutputArray Ps, OutputArray points3d, InputOutputArray K, bool is_projective=false)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#gae4fb41e10f6d6bad54f2555fc8902dbb',1,'cv::sfm::reconstruct(const std::vector< String > images, OutputArray Rs, OutputArray Ts, InputOutputArray K, OutputArray points3d, bool is_projective=false)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#ga279c084302ae1d7541d458e4b23fabd3',1,'reconstruct(InputArrayOfArrays points2d, OutputArray Ps, OutputArray points3d, InputOutputArray K, bool is_projective=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#gaadb8cc60069485cbb9273b1efebd757d',1,'reconstruct(InputArrayOfArrays points2d, OutputArray Rs, OutputArray Ts, InputOutputArray K, OutputArray points3d, bool is_projective=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#ga2d2661dc124447c3ff1c589eb8354768',1,'reconstruct(const std::vector< String > images, OutputArray Ps, OutputArray points3d, InputOutputArray K, bool is_projective=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#gae4fb41e10f6d6bad54f2555fc8902dbb',1,'reconstruct(const std::vector< String > images, OutputArray Rs, OutputArray Ts, InputOutputArray K, OutputArray points3d, bool is_projective=false)(Global Namespace)']]], - ['reconstruct_2ehpp_192',['reconstruct.hpp',['https://docs.opencv.org/4.2.0/d3/de1/reconstruct_8hpp.html',1,'']]], - ['reconstructedmatrix_193',['reconstructedMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a191a4f598b0c192a83ab48984e87ee51',1,'Eigen::FullPivLU::reconstructedMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#ae3693372ca29f50d87d324dfadaae148',1,'Eigen::LDLT::reconstructedMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a8b6ba1bc41811c50e65cac8db597d802',1,'Eigen::LLT::reconstructedMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#aba7f1ee83537b0d240ebf206503a4920',1,'Eigen::PartialPivLU::reconstructedMatrix()']]], - ['reconstruction_194',['Reconstruction',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html',1,'Camera Calibration and 3D Reconstruction'],['https://docs.opencv.org/4.2.0/d9/db7/tutorial_py_table_of_contents_calib3d.html',1,'Camera Calibration and 3D Reconstruction']]], - ['reconstruction_195',['Custom Calibration Pattern for 3D reconstruction',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html',1,'']]], - ['reconstruction_196',['Reconstruction',['https://docs.opencv.org/4.2.0/de/dfd/tutorial_sfm_import_reconstruction.html',1,'Import Reconstruction'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html',1,'Reconstruction'],['https://docs.opencv.org/4.2.0/d4/d18/tutorial_sfm_scene_reconstruction.html',1,'Scene Reconstruction']]], - ['reconstruction_20calib3d_20module_197',['Camera calibration and 3D reconstruction (calib3d module)',['https://docs.opencv.org/4.2.0/d6/d55/tutorial_table_of_content_calib3d.html',1,'']]], - ['record_198',['record',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#a81021ecb82ef875935c20f74f053d5c3',1,'cv::cuda::Event']]], - ['recordassetwriter_199',['recordAssetWriter',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#aa102efe4c203eeeeae7e87e163b00a04',1,'CvVideoCamera']]], - ['recordassetwriterinput_200',['recordAssetWriterInput',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#ac5d77802f8111ceac9c8e4a403139e01',1,'CvVideoCamera']]], - ['recordpixelbufferadaptor_201',['recordPixelBufferAdaptor',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#aca9dc5fa789ab937293e5208be7ed878',1,'CvVideoCamera']]], - ['recordvideo_202',['recordVideo',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#a7a2d067e74a18cd9cc5ee7626ac27660',1,'CvVideoCamera']]], - ['recoverpose_203',['recoverPose',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gadb7d2dfcc184c1d2f496d8639f4371c0',1,'cv::recoverPose(InputArray E, InputArray points1, InputArray points2, InputArray cameraMatrix, OutputArray R, OutputArray t, InputOutputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga40919d0c7eaf77b0df67dd76d5d24fa1',1,'cv::recoverPose(InputArray E, InputArray points1, InputArray points2, OutputArray R, OutputArray t, double focal=1.0, Point2d pp=Point2d(0, 0), InputOutputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga2ee9f187170acece29c5172c2175e7ae',1,'cv::recoverPose(InputArray E, InputArray points1, InputArray points2, InputArray cameraMatrix, OutputArray R, OutputArray t, double distanceThresh, InputOutputArray mask=noArray(), OutputArray triangulatedPoints=noArray())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gadb7d2dfcc184c1d2f496d8639f4371c0',1,'recoverPose(InputArray E, InputArray points1, InputArray points2, InputArray cameraMatrix, OutputArray R, OutputArray t, InputOutputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga40919d0c7eaf77b0df67dd76d5d24fa1',1,'recoverPose(InputArray E, InputArray points1, InputArray points2, OutputArray R, OutputArray t, double focal=1.0, Point2d pp=Point2d(0, 0), InputOutputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga2ee9f187170acece29c5172c2175e7ae',1,'recoverPose(InputArray E, InputArray points1, InputArray points2, InputArray cameraMatrix, OutputArray R, OutputArray t, double distanceThresh, InputOutputArray mask=noArray(), OutputArray triangulatedPoints=noArray())(Global Namespace)']]], - ['rect_204',['Rect',['https://docs.opencv.org/4.2.0/d3/d22/classcv_1_1gapi_1_1own_1_1Rect.html',1,'cv::gapi::own::Rect'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html',1,'cv::gapi::wip::draw::Rect']]], - ['rect_205',['rect',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a08ac8ae42d4cbf36d67dcbe7e593e68c',1,'cv::text::ERStat::rect'],['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#a29828a29695992a325c0a4f1427b0318',1,'cv::CvHOGEvaluator::Feature::rect'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html#a869b446f1666163f953a2d1d77174c8f',1,'cv::CvLBPEvaluator::Feature::rect'],['https://docs.opencv.org/4.2.0/d7/de4/structcv_1_1dpm_1_1DPMDetector_1_1ObjectDetection.html#af1ee05059aabd53e22cdbda1a8443493',1,'cv::dpm::DPMDetector::ObjectDetection::rect'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html#ac75c091cf396bcca8d070134c808a5a7',1,'cv::gapi::wip::draw::Rect::rect'],['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#a4db258c3dea1221a7f2d89d79e124dae',1,'cv::tbm::TrackedObject::rect']]], - ['rect_206',['Rect',['https://docs.opencv.org/4.2.0/d3/d22/classcv_1_1gapi_1_1own_1_1Rect.html#ab27b16b8f1d5dfba437462074c62df5e',1,'cv::gapi::own::Rect::Rect()=default'],['https://docs.opencv.org/4.2.0/d3/d22/classcv_1_1gapi_1_1own_1_1Rect.html#ac15c0e7711aef114842c03f626c6fc3f',1,'cv::gapi::own::Rect::Rect(int _x, int _y, int _width, int _height)'],['https://docs.opencv.org/4.2.0/d3/d22/classcv_1_1gapi_1_1own_1_1Rect.html#a0be75e61b2fbf5eb61304c2b289aba3e',1,'cv::gapi::own::Rect::Rect(const cv::Rect &other)'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html#aa462af8359a90be862f644cea5fe01b1',1,'cv::gapi::wip::draw::Rect::Rect()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga11d95de507098e90bad732b9345402e8',1,'cv::Rect'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga11d95de507098e90bad732b9345402e8',1,'Rect(Global Namespace)']]], - ['rect2d_207',['Rect2d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga894fe0940d40d4d65f008a2ca4e616bd',1,'cv::Rect2d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga894fe0940d40d4d65f008a2ca4e616bd',1,'Rect2d(Global Namespace)']]], - ['rect2f_208',['Rect2f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2d6c1acbbb651cf626f138748aac3d02',1,'cv::Rect2f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2d6c1acbbb651cf626f138748aac3d02',1,'Rect2f(Global Namespace)']]], - ['rect2i_209',['Rect2i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaa87c8f580952d28b4127261994bce7d8',1,'cv::Rect2i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaa87c8f580952d28b4127261994bce7d8',1,'Rect2i(Global Namespace)']]], - ['rect_5f_210',['Rect_',['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html',1,'cv::Rect_< _Tp >'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#afb53dd5c7f9a57ecb3d50d62d2d6dd14',1,'cv::Rect_::Rect_()'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a5a41149f4b012b9f323b5913454375a1',1,'cv::Rect_::Rect_(_Tp _x, _Tp _y, _Tp _width, _Tp _height)'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a65947237f63dd8349884e0230835cf13',1,'cv::Rect_::Rect_(const Rect_ &r)'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#ad5650c613e0fee370c42e002acc9be8c',1,'cv::Rect_::Rect_(Rect_ &&r) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#ad03e77a67595ae76f241ac0a92b11bd3',1,'cv::Rect_::Rect_(const Point_< _Tp > &org, const Size_< _Tp > &sz)'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a388c33991cecd4942fe24a0cf32a4ad4',1,'cv::Rect_::Rect_(const Point_< _Tp > &pt1, const Point_< _Tp > &pt2)']]], - ['rectangle_211',['rectangle',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga07d2f74cadcf8e305e810ce8eed13bc9',1,'cv::rectangle(InputOutputArray img, Point pt1, Point pt2, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gac865734d137287c0afb7682ff7b3db23',1,'cv::rectangle(InputOutputArray img, Rect rec, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga07d2f74cadcf8e305e810ce8eed13bc9',1,'rectangle(InputOutputArray img, Point pt1, Point pt2, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gac865734d137287c0afb7682ff7b3db23',1,'rectangle(InputOutputArray img, Rect rec, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)']]], - ['rectanglesintersecttypes_212',['RectanglesIntersectTypes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaaf0eb9e10bd5adcbd446cd31fea2db68',1,'cv::RectanglesIntersectTypes'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaaf0eb9e10bd5adcbd446cd31fea2db68',1,'RectanglesIntersectTypes(Global Namespace)']]], - ['rectify3collinear_213',['rectify3Collinear',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gabd5437becb62abc0fe951c532a94b655',1,'cv::rectify3Collinear()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gabd5437becb62abc0fe951c532a94b655',1,'rectify3Collinear()(Global Namespace)']]], - ['rectify_5fcylindrical_214',['RECTIFY_CYLINDRICAL',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedea1c393e788481b0d3d430f34ca48c9b48',1,'cv::omnidir::RECTIFY_CYLINDRICAL'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedea1c393e788481b0d3d430f34ca48c9b48',1,'RECTIFY_CYLINDRICAL(Global Namespace)']]], - ['rectify_5flonglati_215',['RECTIFY_LONGLATI',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedeabe86f27bd18947404765e70eb9f90787',1,'cv::omnidir::RECTIFY_LONGLATI'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedeabe86f27bd18947404765e70eb9f90787',1,'RECTIFY_LONGLATI(Global Namespace)']]], - ['rectify_5fperspective_216',['RECTIFY_PERSPECTIVE',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedea31955c9ca6f1102df0d2149947194907',1,'cv::omnidir::RECTIFY_PERSPECTIVE'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedea31955c9ca6f1102df0d2149947194907',1,'RECTIFY_PERSPECTIVE(Global Namespace)']]], - ['rectify_5fstereographic_217',['RECTIFY_STEREOGRAPHIC',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedea6abf85110a5c5b2d8394442e22bdcb1d',1,'cv::omnidir::RECTIFY_STEREOGRAPHIC'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedea6abf85110a5c5b2d8394442e22bdcb1d',1,'RECTIFY_STEREOGRAPHIC(Global Namespace)']]], - ['rectsize_218',['rectSize',['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html#aba52f3c8ba1f16655c33673ad90a1045',1,'cv::TrackerFeatureHAAR::Params']]], - ['rectstddev_219',['rectStdDev',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac311484a4e57cab2ce2cfdc195fda7ee',1,'cv::cuda::rectStdDev()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac311484a4e57cab2ce2cfdc195fda7ee',1,'rectStdDev()(Global Namespace)']]], - ['recurs_5ffilter_220',['RECURS_FILTER',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ggaf454b747a111dc9819419b99807ae7aca54c35da37a520d619d8a149d9b463d73',1,'cv::RECURS_FILTER'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ggaf454b747a111dc9819419b99807ae7aca54c35da37a520d619d8a149d9b463d73',1,'RECURS_FILTER(Global Namespace)']]], - ['recursive_221',['recursive',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298af8e45531a3ea3d5c1247b004985175a4',1,'recursive(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298af8e45531a3ea3d5c1247b004985175a4',1,'recursive(Global Namespace)']]], - ['recursive_5finit_5ferror_222',['recursive_init_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01655.html',1,'__gnu_cxx']]], - ['recursive_5fmutex_223',['recursive_mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02611.html',1,'std']]], - ['recursive_5ftimed_5fmutex_224',['recursive_timed_mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02619.html',1,'std']]], - ['red_225',['red',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1e1372991e755607437574ed62863701',1,'cv::viz::Color']]], - ['redirecterror_226',['redirectError',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga8cd28eccccb695570cdaf86a572d2c0c',1,'cv::redirectError()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga8cd28eccccb695570cdaf86a572d2c0c',1,'redirectError()(Global Namespace)']]], - ['reduce_227',['reduce',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga4b78072a303f29d9031d56e5638da78e',1,'cv::reduce()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga21d57f661db7be093caf2c4378be2007',1,'cv::cuda::reduce()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga4b78072a303f29d9031d56e5638da78e',1,'reduce(InputArray src, OutputArray dst, int dim, int rtype, int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga21d57f661db7be093caf2c4378be2007',1,'reduce(InputArray mtx, OutputArray vec, int dim, int reduceOp, int dtype=-1, Stream &stream=Stream::Null())(Global Namespace)']]], - ['reduce_2ehpp_228',['reduce.hpp',['https://docs.opencv.org/4.2.0/da/dca/modules_2core_2include_2opencv2_2core_2cuda_2detail_2reduce_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d78/modules_2core_2include_2opencv2_2core_2cuda_2reduce_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d33/contrib_2modules_2cudev_2include_2opencv2_2cudev_2block_2reduce_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d25/contrib_2modules_2cudev_2include_2opencv2_2cudev_2grid_2reduce_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/da3/contrib_2modules_2cudev_2include_2opencv2_2cudev_2warp_2reduce_8hpp.html',1,'(Global Namespace)']]], - ['reduce_5favg_229',['REDUCE_AVG',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a85f039992a454ca367bc190529766c7e',1,'cv::REDUCE_AVG'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a85f039992a454ca367bc190529766c7e',1,'REDUCE_AVG(Global Namespace)']]], - ['reduce_5fkey_5fval_2ehpp_230',['reduce_key_val.hpp',['https://docs.opencv.org/4.2.0/d3/dbd/reduce__key__val_8hpp.html',1,'']]], - ['reduce_5fmax_231',['REDUCE_MAX',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a928b4c3eb0a038ea41b61d122c0495ee',1,'cv::REDUCE_MAX'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a928b4c3eb0a038ea41b61d122c0495ee',1,'REDUCE_MAX(Global Namespace)']]], - ['reduce_5fmin_232',['REDUCE_MIN',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a1f40a2ed66c8a8b8198186da47ec7b76',1,'cv::REDUCE_MIN'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a1f40a2ed66c8a8b8198186da47ec7b76',1,'REDUCE_MIN(Global Namespace)']]], - ['reduce_5fsum_233',['REDUCE_SUM',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a101441e283ed69f20cfc5468114f9867',1,'cv::REDUCE_SUM'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a101441e283ed69f20cfc5468114f9867',1,'REDUCE_SUM(Global Namespace)']]], - ['reduce_5fto_5fvec_2ehpp_234',['reduce_to_vec.hpp',['https://docs.opencv.org/4.2.0/d3/ddc/reduce__to__vec_8hpp.html',1,'']]], - ['reduceblock_235',['reduceBlock',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a0dc5e4cdaeaed5adb32bba9a92a4940e',1,'cv::cudev::NormHamming::reduceBlock()'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#aa92b2c0f877c54d3882c0b100fc34047',1,'cv::cudev::NormL1::reduceBlock()'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#a77368b8f3a5388c0d8aab169b148b8d9',1,'cv::cudev::NormL1< float >::reduceBlock()'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#ab5574d531bf6a65ce406741c921d0cf5',1,'cv::cudev::NormL2::reduceBlock()']]], - ['reducethread_236',['reduceThread',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#adac882811d25124956b6d8ddda1c7e74',1,'cv::cudev::NormHamming::reduceThread()'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#a8cf5faf0d148ffcbe8f7f860c4f2a957',1,'cv::cudev::NormL1::reduceThread()'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#a5b3bb11403b190f8d70acf26e4968337',1,'cv::cudev::NormL1< float >::reduceThread()'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#a61937ce719e08eb0a3260d0fad988a38',1,'cv::cudev::NormL2::reduceThread()']]], - ['reducetocolumn_5f_237',['reduceToColumn_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dce3e82ca9e9e5864749f753849f3ab',1,'cv::cudev::reduceToColumn_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dce3e82ca9e9e5864749f753849f3ab',1,'reduceToColumn_()(Global Namespace)']]], - ['reducetocolumnbody_238',['ReduceToColumnBody',['https://docs.opencv.org/4.2.0/d5/df4/structcv_1_1cudev_1_1ReduceToColumnBody.html',1,'cv::cudev']]], - ['reducetorow_5f_239',['reduceToRow_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba37f3bcb1334e0963fc6a4581c42676',1,'cv::cudev::reduceToRow_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba37f3bcb1334e0963fc6a4581c42676',1,'reduceToRow_()(Global Namespace)']]], - ['reducetorowbody_240',['ReduceToRowBody',['https://docs.opencv.org/4.2.0/da/d58/structcv_1_1cudev_1_1ReduceToRowBody.html',1,'cv::cudev']]], - ['reducetypes_241',['ReduceTypes',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga14cdedf2933367eb9395ec16798af994',1,'cv::ReduceTypes'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga14cdedf2933367eb9395ec16798af994',1,'ReduceTypes(Global Namespace)']]], - ['reducewarp_242',['reduceWarp',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a97c78787ce8b28690b52ee1d96b44ff5',1,'cv::cudev::NormHamming::reduceWarp()'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#a03732d5db6c696ea362cb2fc513a77df',1,'cv::cudev::NormL1::reduceWarp()'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#ae19f65c96ac924ee30eb993000c76c16',1,'cv::cudev::NormL1< float >::reduceWarp()'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#a48ce2566f027a78ceec676b4b17d36fe',1,'cv::cudev::NormL2::reduceWarp()']]], - ['reduction_2ehpp_243',['reduction.hpp',['https://docs.opencv.org/4.2.0/d2/da5/reduction_8hpp.html',1,'']]], - ['reductionratio_244',['reductionRatio',['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#a71a58b2c109e955cc3576bb1a89de952',1,'cv::line_descriptor::BinaryDescriptor::Params']]], - ['reductions_245',['Matrix Reductions',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html',1,'']]], - ['reductions_20visitors_20and_20broadcasting_246',['Reductions, visitors and broadcasting',['https://eigen.tuxfamily.org/dox/group__TutorialReductionsVisitorsBroadcasting.html',1,'']]], - ['redux_247',['redux',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a63ce1e4fab36bff43bbadcdd06a67724',1,'Eigen::DenseBase::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a63ce1e4fab36bff43bbadcdd06a67724',1,'DenseBase< ArrayWrapper< ExpressionType > >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a63ce1e4fab36bff43bbadcdd06a67724',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a63ce1e4fab36bff43bbadcdd06a67724',1,'DenseBase< Solve< Decomposition, RhsType > >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'Eigen::VectorwiseOp::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const Derived, Horizontal >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const Derived, Vertical >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::redux()']]], - ['ref_248',['Ref',['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref.html',1,'Eigen::Ref< class, Options, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref.html#a037addaa81f13e5765e30a92d2c4f2b1',1,'Eigen::Ref::Ref()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref.html#a037addaa81f13e5765e30a92d2c4f2b1',1,'Ref< const KLUMatrixType, StandardCompressedFormat >::Ref()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref.html#a037addaa81f13e5765e30a92d2c4f2b1',1,'Ref< const UmfpackMatrixType, StandardCompressedFormat >::Ref()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref_3_01SparseMatrixType_00_01Options_01_4.html#a5a27af935f839a42d85421f5cce99a68',1,'Eigen::Ref< SparseMatrixType, Options >::Ref()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref_3_01SparseVectorType_01_4.html#a125c83639030247f78157fa606c03f56',1,'Eigen::Ref< SparseVectorType >::Ref()']]], - ['ref_249',['ref',['https://docs.opencv.org/4.2.0/d4/d6a/structcv_1_1optflow_1_1GPCPatchSample.html#af4dc7f46ece01e93bbe2f75847f8275d',1,'cv::optflow::GPCPatchSample::ref'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a0e1e95540e8cc75976bb4be97dc2203e',1,'cv::SparseMat::ref(int i0, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a565a2111e6223af3d3e7d7af2db7588b',1,'cv::SparseMat::ref(int i0, int i1, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a8123bdba2899184e4946c82b2ddaa541',1,'cv::SparseMat::ref(int i0, int i1, int i2, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a31eeb43c5070301db9cba23bdb45ee11',1,'cv::SparseMat::ref(const int *idx, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a0e1e95540e8cc75976bb4be97dc2203e',1,'cv::SparseMat::ref(int i0, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a565a2111e6223af3d3e7d7af2db7588b',1,'cv::SparseMat::ref(int i0, int i1, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a8123bdba2899184e4946c82b2ddaa541',1,'cv::SparseMat::ref(int i0, int i1, int i2, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a31eeb43c5070301db9cba23bdb45ee11',1,'cv::SparseMat::ref(const int *idx, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a17c4339e51120f3f31a21f2d8145aa4a',1,'cv::SparseMat_::ref(int i0, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ab5627691b3f57c2f8be0a0c0a27178e7',1,'cv::SparseMat_::ref(int i0, int i1, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#aecb8e3bf1734c3c0ee967f3149aebe03',1,'cv::SparseMat_::ref(int i0, int i1, int i2, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ae7872bd52762f694af7f76251770de3e',1,'cv::SparseMat_::ref(const int *idx, size_t *hashval=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a1912c220e1851d8dd8484d3cb6317b33',1,'std::ref(_Tp &__t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab5fa68ff7314fb4425b6183fe9478a39',1,'std::ref(const _Tp &&)=delete'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa6e7c9ad5dbd731664fab89868983bc8',1,'std::ref(reference_wrapper< _Tp > __t) noexcept']]], - ['ref_3c_20const_20klumatrixtype_2c_20standardcompressedformat_20_3e_250',['Ref< const KLUMatrixType, StandardCompressedFormat >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref.html',1,'']]], - ['ref_3c_20const_20umfpackmatrixtype_2c_20standardcompressedformat_20_3e_251',['Ref< const UmfpackMatrixType, StandardCompressedFormat >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref.html',1,'']]], - ['ref_3c_20sparsematrixtype_2c_20options_20_3e_252',['Ref< SparseMatrixType, Options >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref_3_01SparseMatrixType_00_01Options_01_4.html',1,'Eigen']]], - ['ref_3c_20sparsevectortype_20_3e_253',['Ref< SparseVectorType >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref_3_01SparseVectorType_01_4.html',1,'Eigen']]], - ['refcount_254',['refcount',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#af528e8b675a72fd79ff1f399b7dd42df',1,'cv::cuda::GpuMat::refcount'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#acdcfa90051a2b0cc818ab61ea3f89f74',1,'cv::SparseMat::Hdr::refcount'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ae3e7ec959e9a6a3142d55f1896be1b6e',1,'cv::cuda::HostMem::refcount'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a21d534e3d518241614744ecf92119a84',1,'cv::UMatData::refcount']]], - ['reference_255',['reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01827.html',1,'std::bitset< _Nb >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09791.html',1,'std::tr2::dynamic_bitset< _WordT, _Alloc >::reference'],['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#aedfc9a03a8436ad9e5eb43087218bc1c',1,'cv::Allocator::reference'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#adcdcae6ba6e9dd41264343403cde9fb4',1,'cv::MatConstIterator::reference'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a6718367fb9f2782d6e02f47d5ef4e9e3',1,'cv::MatConstIterator_::reference'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ab4f7e3e091002b4b6ae3f14919ff357d',1,'cv::MatIterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a00a0a67e9558dd2891dd4ddc9a568fab',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11631.html#a4ad1cd9fab408c3e3bb9aaac4fb02ca9',1,'__gnu_pbds::detail::bin_search_tree_node_it_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#adc01f11049fc8b3283d60458c4e2d04f',1,'__gnu_pbds::detail::binary_heap_const_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a28fd70badd5b824bf3269a0da6fe1765',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#ab5f6bb8d56264c9fa8c54b38ffda86ce',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a51d72ce957898641d2c4ccb57af15b36',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#aaf84a768bee3b8ec22ac16b461865bea',1,'const_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< input_iterator_tag, _CharT, _Traits::off_type, _CharT *, _CharT >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< input_iterator_tag, _Tp, _Dist, const _Tp *, const _Tp & >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< iterator_traits< _Iterator >::iterator_category, iterator_traits< _Iterator >::value_type, iterator_traits< _Iterator >::difference_type, iterator_traits< _Iterator >::pointer, iterator_traits< _Iterator >::reference >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< output_iterator_tag, void, void, void, void >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< std::output_iterator_tag, void, void, void, void >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< std::random_access_iterator_tag, _CharT >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< std::random_access_iterator_tag, bool >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a44c68d704c42fe7722c558da7f2072c8',1,'iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a28963e0d8e208b99c3de414baa3ac4de',1,'point_const_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#abe840ee0131ad7258892877c91ee8448',1,'point_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::back_insert_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::front_insert_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::insert_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::istream_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::istreambuf_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::ostream_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::ostreambuf_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::raw_storage_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a9e362ba78518dfe70c4ea6159cae235a',1,'std::set::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a9e362ba78518dfe70c4ea6159cae235a',1,'std::set::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3e1eaafb2b3f1f11809491426d373485',1,'std::unordered_map::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3e1eaafb2b3f1f11809491426d373485',1,'std::unordered_map::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a08487e5381fd61795c61cfa0fed8e48f',1,'std::unordered_multimap::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a08487e5381fd61795c61cfa0fed8e48f',1,'std::unordered_multimap::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a81000aff43253d8859a4c59d35a89029',1,'std::unordered_multiset::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a81000aff43253d8859a4c59d35a89029',1,'std::unordered_multiset::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a111a313624cf9219526288500218d406',1,'std::unordered_set::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a111a313624cf9219526288500218d406',1,'std::unordered_set::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3e1eaafb2b3f1f11809491426d373485',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3e1eaafb2b3f1f11809491426d373485',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::reference'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a220ae98554a76205fb7f8822d36b2d5a.html#a220ae98554a76205fb7f8822d36b2d5a',1,'nlohmann::basic_json::reference']]], - ['reference_256',['Reference',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__Reference.html',1,'Reference'],['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__Reference.html',1,'Reference'],['https://eigen.tuxfamily.org/dox/group__Sparse__Reference.html',1,'Reference'],['https://eigen.tuxfamily.org/dox/group__Geometry__Reference.html',1,'Reference']]], - ['reference_20guide_257',['Quick reference guide',['https://eigen.tuxfamily.org/dox/group__QuickRefPage.html',1,'']]], - ['reference_20guide_20for_20sparse_20matrices_258',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], - ['reference_5fwrapper_259',['reference_wrapper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04235.html',1,'std']]], - ['referencing_20opencv_20from_20other_20doxygen_20projects_260',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], - ['referred_5ftype_261',['referred_type',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a240d245bd8371de57dfda3ece5b2bd1a',1,'cv::cudev::TypeTraits']]], - ['refine_5fintrinsics_262',['refine_intrinsics',['https://docs.opencv.org/4.2.0/d1/d61/classcv_1_1sfm_1_1libmv__ReconstructionOptions.html#ad29acc9d64442e328ce12495b24f1bb5',1,'cv::sfm::libmv_ReconstructionOptions']]], - ['refinedetectedmarkers_263',['refineDetectedMarkers',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga13a2742381c0a48e146d230a8cda2e66',1,'cv::aruco::refineDetectedMarkers()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga13a2742381c0a48e146d230a8cda2e66',1,'refineDetectedMarkers()(Global Namespace)']]], - ['refinement_5fmask_5f_264',['refinement_mask_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a56ea71911cc8a1693544f2f6a890ba73',1,'cv::detail::BundleAdjusterBase']]], - ['refinementmask_265',['refinementMask',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a78c3d35fb56343accaf1ee5fc9441713',1,'cv::detail::BundleAdjusterBase']]], - ['refwrap_2eh_266',['refwrap.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00464.html',1,'']]], - ['reg_5fdisable_267',['REG_DISABLE',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#ac3b362508385fbbeffac160e686d9c86aa12900650a9437f14dbbc050ea6dc55c',1,'cv::ml::LogisticRegression']]], - ['reg_5fl1_268',['REG_L1',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#ac3b362508385fbbeffac160e686d9c86a873eafcec3a7d20bd876352d52607795',1,'cv::ml::LogisticRegression']]], - ['reg_5fl2_269',['REG_L2',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#ac3b362508385fbbeffac160e686d9c86a93f8b6971edc02d1b7984b305b6ac17c',1,'cv::ml::LogisticRegression']]], - ['regex_270',['regex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00128.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga8fceaea413a55303731b390fbd660163',1,'std::regex'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga8fceaea413a55303731b390fbd660163',1,'regex(Global Namespace)']]], - ['regex_2eh_271',['regex.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00467.html',1,'']]], - ['regex_2etcc_272',['regex.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00470.html',1,'']]], - ['regex_5fautomaton_2eh_273',['regex_automaton.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00473.html',1,'']]], - ['regex_5fautomaton_2etcc_274',['regex_automaton.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00476.html',1,'']]], - ['regex_5fcompiler_2eh_275',['regex_compiler.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00479.html',1,'']]], - ['regex_5fcompiler_2etcc_276',['regex_compiler.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00482.html',1,'']]], - ['regex_5fconstants_2eh_277',['regex_constants.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00485.html',1,'']]], - ['regex_5ferror_278',['regex_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06867.html',1,'std::regex_error'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06867.html#a44d4ab569c3f1f9146b8cb4b1f4897c0',1,'std::regex_error::regex_error()']]], - ['regex_5ferror_2eh_279',['regex_error.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00488.html',1,'']]], - ['regex_5fexecutor_2eh_280',['regex_executor.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00491.html',1,'']]], - ['regex_5fexecutor_2etcc_281',['regex_executor.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00494.html',1,'']]], - ['regex_5fiterator_282',['regex_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html',1,'std::regex_iterator< class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a862caa6457b78a0ec1d477dfda124c5d',1,'std::regex_iterator::regex_iterator()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a656c2c42931bc138a1cc6e545cb16651',1,'std::regex_iterator::regex_iterator(_Bi_iter __a, _Bi_iter __b, const regex_type &__re, regex_constants::match_flag_type __m=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a6d2f585edf7bc1a45730ea200dabb86e',1,'std::regex_iterator::regex_iterator(const regex_iterator &)=default']]], - ['regex_5fmatch_283',['regex_match',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa55e272e1102f2c2d62d44bc39ca4ed3',1,'std::regex_match(_Bi_iter __s, _Bi_iter __e, match_results< _Bi_iter, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga56856a210c4b6150bb0b64dddcdc9578',1,'std::regex_match(_Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga801fe7c19ab7cf5bb7cbf7ff03c4e5eb',1,'std::regex_match(const _Ch_type *__s, match_results< const _Ch_type *, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __f=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga23ab0d8ecb63ccfb2f2130947f977c32',1,'std::regex_match(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &__s, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga79853ee819b851413b45e03e066c6b7b',1,'std::regex_match(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &&, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &, const basic_regex< _Ch_type, _Rx_traits > &, regex_constants::match_flag_type=regex_constants::match_default)=delete'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga975d1c6755647e1b45bddb5a6c3736bc',1,'std::regex_match(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __f=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gac9bdb8370891a6588cf4f75850236e53',1,'std::regex_match(const basic_string< _Ch_type, _Ch_traits, _Str_allocator > &__s, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa55e272e1102f2c2d62d44bc39ca4ed3',1,'regex_match(_Bi_iter __s, _Bi_iter __e, match_results< _Bi_iter, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga56856a210c4b6150bb0b64dddcdc9578',1,'regex_match(_Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga801fe7c19ab7cf5bb7cbf7ff03c4e5eb',1,'regex_match(const _Ch_type *__s, match_results< const _Ch_type *, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __f=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga23ab0d8ecb63ccfb2f2130947f977c32',1,'regex_match(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &__s, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga79853ee819b851413b45e03e066c6b7b',1,'regex_match(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &&, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &, const basic_regex< _Ch_type, _Rx_traits > &, regex_constants::match_flag_type=regex_constants::match_default)=delete(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga975d1c6755647e1b45bddb5a6c3736bc',1,'regex_match(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __f=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gac9bdb8370891a6588cf4f75850236e53',1,'regex_match(const basic_string< _Ch_type, _Ch_traits, _Str_allocator > &__s, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)']]], - ['regex_5freplace_284',['regex_replace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga92fc4fdd0f158a2779495ff609213cee',1,'std::regex_replace(_Out_iter __out, _Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__e, const basic_string< _Ch_type, _St, _Sa > &__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5e4ce407b27fd6d1d4502b6a47f48baa',1,'std::regex_replace(_Out_iter __out, _Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__e, const _Ch_type *__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga3bcb11315d31d20f37b9c1b78e030f90',1,'std::regex_replace(const basic_string< _Ch_type, _St, _Sa > &__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const basic_string< _Ch_type, _Fst, _Fsa > &__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gab2a4f515157ae835a3b2bfddc3d5ad5e',1,'std::regex_replace(const basic_string< _Ch_type, _St, _Sa > &__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const _Ch_type *__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gacd17678735431a5df3f0109050c15200',1,'std::regex_replace(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const basic_string< _Ch_type, _St, _Sa > &__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga90ecc0db56fc72636b31613801f8e738',1,'std::regex_replace(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const _Ch_type *__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga92fc4fdd0f158a2779495ff609213cee',1,'regex_replace(_Out_iter __out, _Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__e, const basic_string< _Ch_type, _St, _Sa > &__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5e4ce407b27fd6d1d4502b6a47f48baa',1,'regex_replace(_Out_iter __out, _Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__e, const _Ch_type *__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga3bcb11315d31d20f37b9c1b78e030f90',1,'regex_replace(const basic_string< _Ch_type, _St, _Sa > &__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const basic_string< _Ch_type, _Fst, _Fsa > &__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gab2a4f515157ae835a3b2bfddc3d5ad5e',1,'regex_replace(const basic_string< _Ch_type, _St, _Sa > &__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const _Ch_type *__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gacd17678735431a5df3f0109050c15200',1,'regex_replace(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const basic_string< _Ch_type, _St, _Sa > &__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga90ecc0db56fc72636b31613801f8e738',1,'regex_replace(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const _Ch_type *__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)']]], - ['regex_5fscanner_2eh_285',['regex_scanner.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00497.html',1,'']]], - ['regex_5fscanner_2etcc_286',['regex_scanner.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00500.html',1,'']]], - ['regex_5fsearch_287',['regex_search',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gabe7986685f56116bf30c2f91d72ab9b6',1,'std::regex_search(_Bi_iter __s, _Bi_iter __e, match_results< _Bi_iter, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga66522d5eacabc953cc2e2512018b1eaf',1,'std::regex_search(_Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1c7c948a359f622835764f0c739095d1',1,'std::regex_search(const _Ch_type *__s, match_results< const _Ch_type *, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __f=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga74001d5fb6cc2788210770519eceed7d',1,'std::regex_search(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __f=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga295b45a2979a0b78d1f8cf3958a1a1a0',1,'std::regex_search(const basic_string< _Ch_type, _Ch_traits, _String_allocator > &__s, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5d9b5360c3e14ab995f44a4f25a58b5e',1,'std::regex_search(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &__s, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __f=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5b3d18a746c2b6e12058e6769214a38c',1,'std::regex_search(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &&, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &, const basic_regex< _Ch_type, _Rx_traits > &, regex_constants::match_flag_type=regex_constants::match_default)=delete'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gabe7986685f56116bf30c2f91d72ab9b6',1,'regex_search(_Bi_iter __s, _Bi_iter __e, match_results< _Bi_iter, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga66522d5eacabc953cc2e2512018b1eaf',1,'regex_search(_Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1c7c948a359f622835764f0c739095d1',1,'regex_search(const _Ch_type *__s, match_results< const _Ch_type *, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __f=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga74001d5fb6cc2788210770519eceed7d',1,'regex_search(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __f=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga295b45a2979a0b78d1f8cf3958a1a1a0',1,'regex_search(const basic_string< _Ch_type, _Ch_traits, _String_allocator > &__s, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5d9b5360c3e14ab995f44a4f25a58b5e',1,'regex_search(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &__s, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __f=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5b3d18a746c2b6e12058e6769214a38c',1,'regex_search(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &&, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &, const basic_regex< _Ch_type, _Rx_traits > &, regex_constants::match_flag_type=regex_constants::match_default)=delete(Global Namespace)']]], - ['regex_5ftoken_5fiterator_288',['regex_token_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html',1,'std::regex_token_iterator< class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a8c4dd6b95c7ec9b573640afc5969ef1f',1,'std::regex_token_iterator::regex_token_iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#af7deee1721c6ee10358595d44e19435a',1,'std::regex_token_iterator::regex_token_iterator(_Bi_iter __a, _Bi_iter __b, const regex_type &__re, int __submatch=0, regex_constants::match_flag_type __m=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a53babd11badb91fd6a656a80013b4dcd',1,'std::regex_token_iterator::regex_token_iterator(_Bi_iter __a, _Bi_iter __b, const regex_type &__re, const std::vector< int > &__submatches, regex_constants::match_flag_type __m=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a55751b985986e1d848bf38628888b40c',1,'std::regex_token_iterator::regex_token_iterator(_Bi_iter __a, _Bi_iter __b, const regex_type &__re, initializer_list< int > __submatches, regex_constants::match_flag_type __m=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a035a02e7d0ca95caa7bbd96f5e333d77',1,'std::regex_token_iterator::regex_token_iterator(_Bi_iter __a, _Bi_iter __b, const regex_type &__re, const int(&__submatches)[_Nm], regex_constants::match_flag_type __m=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a32e6d85c9cd633eeb2ef43d63e54de5f',1,'std::regex_token_iterator::regex_token_iterator(const regex_token_iterator &__rhs)']]], - ['regex_5ftraits_289',['regex_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html',1,'std::regex_traits< _Ch_type >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a4db88d5c982e69fbd0202c02de2f714a',1,'regex_traits< _CharType >::regex_traits()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a4db88d5c982e69fbd0202c02de2f714a',1,'std::regex_traits::regex_traits()']]], - ['regex_5ftraits_3c_20_5fchartype_20_3e_290',['regex_traits< _CharType >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html',1,'']]], - ['regionlayer_291',['RegionLayer',['https://docs.opencv.org/4.2.0/d1/d21/classcv_1_1dnn_1_1RegionLayer.html',1,'cv::dnn']]], - ['register_5fcallback_292',['register_callback',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'basic_ios< char, _Traits >::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'basic_iostream< char >::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'basic_istream< char >::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'basic_istream< char, _Traits >::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'basic_ostream< char >::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'basic_ostream< char, _Traits >::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_fstream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_ifstream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_ios::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_iostream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_istream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_istringstream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_ofstream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_ostream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_ostringstream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_stringstream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::ios_base::register_callback()']]], - ['registerdepth_293',['registerDepth',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0df0ea008a0a040251180f498adb6609',1,'cv::rgbd::registerDepth()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0df0ea008a0a040251180f498adb6609',1,'registerDepth()(Global Namespace)']]], - ['registerkeyboardcallback_294',['registerKeyboardCallback',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#af9796161c280e19cde7e01941d26f35b',1,'cv::viz::Viz3d']]], - ['registerlayer_295',['registerLayer',['https://docs.opencv.org/4.2.0/d4/d67/classcv_1_1dnn_1_1LayerFactory.html#aca69c92ed171a3a1e4ea38f28be20252',1,'cv::dnn::LayerFactory']]], - ['registerlogtag_296',['registerLogTag',['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html#gabbf1817c13a329597611628569270906',1,'cv::utils::logging::registerLogTag()'],['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html#gabbf1817c13a329597611628569270906',1,'registerLogTag()(Global Namespace)']]], - ['registermodeltoscene_297',['registerModelToScene',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1ppf__match__3d_1_1ICP.html#accd9744cedf9cd9cd175d2c5bd77951e',1,'cv::ppf_match_3d::ICP::registerModelToScene(const Mat &srcPC, const Mat &dstPC, double &residual, Matx44d &pose)'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1ppf__match__3d_1_1ICP.html#ab45e66bf4453badc77a4b0e1524673cf',1,'cv::ppf_match_3d::ICP::registerModelToScene(const Mat &srcPC, const Mat &dstPC, std::vector< Pose3DPtr > &poses)']]], - ['registermousecallback_298',['registerMouseCallback',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a1296209cdb8ade50e8a8ad38f1b792cc',1,'cv::viz::Viz3d']]], - ['registerpagelocked_299',['registerPageLocked',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga6d25da8194cc95035994ae98e9eebc02',1,'cv::cuda::registerPageLocked()'],['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga6d25da8194cc95035994ae98e9eebc02',1,'registerPageLocked(Mat &m)(Global Namespace)']]], - ['registration_300',['Registration',['https://docs.opencv.org/4.2.0/dc/def/group__datasets__ir.html',1,'Image Registration'],['https://docs.opencv.org/4.2.0/db/d61/group__reg.html',1,'Image Registration'],['https://docs.opencv.org/4.2.0/df/dc1/group__dnnLayerFactory.html',1,'Utilities for New Layers Registration']]], - ['registrationresol_301',['registrationResol',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a9b90774eabdf68c9ee864918d620538d',1,'cv::Stitcher']]], - ['registry_302',['Query I/O API backends registry',['https://docs.opencv.org/4.2.0/de/db1/group__videoio__registry.html',1,'']]], - ['registry_2ehpp_303',['registry.hpp',['https://docs.opencv.org/4.2.0/d1/da2/registry_8hpp.html',1,'']]], - ['regkinds_304',['RegKinds',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#ac3b362508385fbbeffac160e686d9c86',1,'cv::ml::LogisticRegression']]], - ['regsperblock_305',['regsPerBlock',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#af50b748a77d4fb04cffac350628db957',1,'cv::cuda::DeviceInfo']]], - ['regular_306',['REGULAR',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#aa2a27f17a1a30fad4c54c248b77777e0a9904ebe58740486ab511151a7b9067fd',1,'cv::xfeatures2d::PCTSignatures']]], - ['regular_20expressions_307',['Regular Expressions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html',1,'']]], - ['rehash_308',['rehash',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af81fbed78a715d3c81e8c7655669c7e7',1,'std::unordered_map::rehash()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac9032d22474fc3c5ec4d0b74362b5f4e',1,'std::unordered_multimap::rehash()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a12c1bfb9feb07236289dcf324b841d58',1,'std::unordered_multiset::rehash()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a6f3606a68d349ec1e1e5de56116a39fd',1,'std::unordered_set::rehash()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af81fbed78a715d3c81e8c7655669c7e7',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::rehash()']]], - ['reid_5fthr_309',['reid_thr',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a1b924a1497825d64c7a369fdb9d766a7',1,'cv::tbm::TrackerParams']]], - ['reinterpret_5ffrom_5fint_310',['reinterpret_from_int',['https://docs.opencv.org/4.2.0/d5/d9e/structcv_1_1V__TypeTraits_3_01double_01_4.html#af27e343945e0160e661daae8b45d0092',1,'cv::V_TypeTraits< double >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/da/d19/structcv_1_1V__TypeTraits_3_01float_01_4.html#ab36a4a7b6e20628b2661af4c4fd9156f',1,'cv::V_TypeTraits< float >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/db/d59/structcv_1_1V__TypeTraits_3_01int64_01_4.html#a1e2bfbeb7c75902de3ded8cf5adbe587',1,'cv::V_TypeTraits< int64 >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/d0/d9d/structcv_1_1V__TypeTraits_3_01schar_01_4.html#ae21c7e3916f07f7476f5896d1ce8ee78',1,'cv::V_TypeTraits< schar >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1V__TypeTraits_3_01short_01_4.html#a504a9f8b85ea342c968294d4b8cccbcb',1,'cv::V_TypeTraits< short >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/dd/d1d/structcv_1_1V__TypeTraits_3_01uchar_01_4.html#ab8d70c37b16112590d2256759f69702c',1,'cv::V_TypeTraits< uchar >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/d2/d4d/structcv_1_1V__TypeTraits_3_01uint64_01_4.html#adf44315323474d6be746c869343dbc84',1,'cv::V_TypeTraits< uint64 >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/d3/d8c/structcv_1_1V__TypeTraits_3_01unsigned_01_4.html#a492a401f025a424cc81514ecb94f910f',1,'cv::V_TypeTraits< unsigned >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/d6/dd5/structcv_1_1V__TypeTraits_3_01ushort_01_4.html#a27fc724985045646604f0f4275b9ef9f',1,'cv::V_TypeTraits< ushort >::reinterpret_from_int()']]], - ['reinterpret_5fint_311',['reinterpret_int',['https://docs.opencv.org/4.2.0/d5/d9e/structcv_1_1V__TypeTraits_3_01double_01_4.html#a3e26770e96b8fb79b5b464daf02fd8e6',1,'cv::V_TypeTraits< double >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/da/d19/structcv_1_1V__TypeTraits_3_01float_01_4.html#abca889cc30ca197d1d37b6d2ac675c56',1,'cv::V_TypeTraits< float >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/db/d59/structcv_1_1V__TypeTraits_3_01int64_01_4.html#af4592c2a50ebab7496a18cfa357d6954',1,'cv::V_TypeTraits< int64 >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/d0/d9d/structcv_1_1V__TypeTraits_3_01schar_01_4.html#a1a9a3fbd322f1b6840249b68e89837b4',1,'cv::V_TypeTraits< schar >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1V__TypeTraits_3_01short_01_4.html#aedf2ae31fb492278e2f2fef55809ad72',1,'cv::V_TypeTraits< short >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/dd/d1d/structcv_1_1V__TypeTraits_3_01uchar_01_4.html#a48527cde16dc8cdaed021c021d2ccf32',1,'cv::V_TypeTraits< uchar >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/d2/d4d/structcv_1_1V__TypeTraits_3_01uint64_01_4.html#a13d2344b5309b14932e03ca49d869c1e',1,'cv::V_TypeTraits< uint64 >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/d3/d8c/structcv_1_1V__TypeTraits_3_01unsigned_01_4.html#a1cc7327773b9c215d313ad88d62a8ddd',1,'cv::V_TypeTraits< unsigned >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/d6/dd5/structcv_1_1V__TypeTraits_3_01ushort_01_4.html#a21496198a32d59b5469c5abd536a579b',1,'cv::V_TypeTraits< ushort >::reinterpret_int()']]], - ['relativecameramotion_312',['relativeCameraMotion',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gae9ad20b15801475977147475eef82626',1,'cv::sfm::relativeCameraMotion()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gae9ad20b15801475977147475eef82626',1,'relativeCameraMotion()(Global Namespace)']]], - ['release_313',['release',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a827011c86f30a391123e91e4f776c9f2',1,'cv::_OutputArray::release()'],['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a19c5d9d13d6f234b507ab98c4a8e23f4',1,'cv::ogl::Arrays::release()'],['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a801cbd8a4db7b4d2e01a8c7a37acdb0f',1,'cv::AsyncArray::release()'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#a5373c68ea688b275771e5fe61a205b7f',1,'cv::AsyncPromise::release()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#aae8efb43bb0ece5deffc68308bb70b53',1,'cv::ogl::Buffer::release()'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ad23d5415a06fb4bc97bfa034589b376e',1,'cv::FileStorage::release()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a460951a00945774e9da0b1062ea0a319',1,'cv::cuda::GpuMat::release()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a924b94dc7a70dd17d8c38e0de48ab827',1,'cv::cuda::HostMem::release()'],['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1utils_1_1lock__guard.html#adb7b5ff1eee9bb34cc15a64cbd86cf15',1,'cv::utils::lock_guard::release()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ae48d4913285518e2c21a3457017e716e',1,'cv::Mat::release()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac17505e5b9b1eb27adcfc96cfaff93eb',1,'cv::Mat_::release()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac17505e5b9b1eb27adcfc96cfaff93eb',1,'Mat_< double >::release()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac17505e5b9b1eb27adcfc96cfaff93eb',1,'Mat_< float >::release()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac17505e5b9b1eb27adcfc96cfaff93eb',1,'Mat_< uchar >::release()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac17505e5b9b1eb27adcfc96cfaff93eb',1,'Mat_< unsigned char >::release()'],['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a53c86a62034b699eac5385314a09338f',1,'cv::rgbd::OdometryFrame::release()'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#ad114b1c257b15826a9b1122278054a44',1,'cv::rgbd::RgbdFrame::release()'],['https://docs.opencv.org/4.2.0/d9/d7f/classcv_1_1utils_1_1shared__lock__guard.html#ad5b2c93e6f569b30067b476b26a65be9',1,'cv::utils::shared_lock_guard::release()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a3f4c162afd8cc809d23bd0fe9b38ead7',1,'cv::SparseMat::release()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a91376169e9cf05898fdecc025a8cbb4c',1,'cv::ogl::Texture2D::release()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#aa3e2204675be100726e6088d8e34214a',1,'cv::TLSDataAccumulator::release()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#aa3e2204675be100726e6088d8e34214a',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::release()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#af8c2c374fb21c3bf8421e28290df3630',1,'cv::TLSDataContainer::release()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aa9a894abdfd44e72ef37a4fc10f3481b',1,'cv::UMat::release()'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#afb4ab689e553ba2c8f0fec41b9344ae6',1,'cv::VideoCapture::release()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a667f737e56d5ba6b0533c6c7bf941140',1,'cv::VideoWriter::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a3cdeabd85acfcac56136924e939c29ef',1,'std::auto_ptr::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#af40585665f237aca4a3364726b3fdb1d',1,'std::unique_ptr::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a2738fbe9d4c7a5c93ae36f40ce4794f8',1,'std::unique_ptr< _Tp[], _Dp >::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#af40585665f237aca4a3364726b3fdb1d',1,'unique_ptr< _Codecvt >::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#af40585665f237aca4a3364726b3fdb1d',1,'unique_ptr< _Res_type >::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#af40585665f237aca4a3364726b3fdb1d',1,'unique_ptr< _Result< _Res > >::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#af40585665f237aca4a3364726b3fdb1d',1,'unique_ptr< _Result_base >::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#af40585665f237aca4a3364726b3fdb1d',1,'unique_ptr< bool[]>::release()']]], - ['releaseandgetstring_314',['releaseAndGetString',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a5341a9e09e1b797faf6b7ec40bd558fd',1,'cv::FileStorage']]], - ['releasebitstream_315',['releaseBitStream',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1cudacodec_1_1EncoderCallBack.html#a2eb0f4b44dec63bb43a1eadfcf18bd63',1,'cv::cudacodec::EncoderCallBack']]], - ['releasememory_316',['releaseMemory',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a500401e692acadfd0952362d9519f41f',1,'cv::cuda::SURF_CUDA']]], - ['releasepyramids_317',['releasePyramids',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a517d6c7faa6f010b88e3c9a6a56ccacd',1,'cv::rgbd::OdometryFrame']]], - ['relu_318',['RELU',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ade71470ec8814021728f8b31b09773b0ae206e366e80a947e72df5c149fd74c42',1,'cv::ml::ANN_MLP']]], - ['relu6layer_319',['ReLU6Layer',['https://docs.opencv.org/4.2.0/dc/dcd/classcv_1_1dnn_1_1ReLU6Layer.html',1,'cv::dnn']]], - ['relulayer_320',['ReLULayer',['https://docs.opencv.org/4.2.0/dd/df0/classcv_1_1dnn_1_1ReLULayer.html',1,'cv::dnn']]], - ['remaining_321',['remaining',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a312b069f6804aa1a5d75d6c32bf5751d',1,'cv::FileNodeIterator']]], - ['remap_322',['remap',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gab75ef31ce5cdfb5c44b6da5f3b908ea4',1,'cv::remap()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga0ece6c76e8efa3171adb8432d842beb0',1,'cv::cuda::remap()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gac2c8de7ed8e75e46516246a8365b6298',1,'cv::gapi::remap()'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gab75ef31ce5cdfb5c44b6da5f3b908ea4',1,'remap(InputArray src, OutputArray dst, InputArray map1, InputArray map2, int interpolation, int borderMode=BORDER_CONSTANT, const Scalar &borderValue=Scalar())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gac2c8de7ed8e75e46516246a8365b6298',1,'remap(const GMat &src, const Mat &map1, const Mat &map2, int interpolation, int borderMode=BORDER_CONSTANT, const Scalar &borderValue=Scalar())(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga0ece6c76e8efa3171adb8432d842beb0',1,'remap(InputArray src, OutputArray dst, InputArray xmap, InputArray ymap, int interpolation, int borderMode=BORDER_CONSTANT, Scalar borderValue=Scalar(), Stream &stream=Stream::Null())(Global Namespace)']]], - ['remap_2ehpp_323',['remap.hpp',['https://docs.opencv.org/4.2.0/d1/d59/remap_8hpp.html',1,'']]], - ['remap_2emarkdown_324',['remap.markdown',['https://docs.opencv.org/4.2.0/df/ded/remap_8markdown.html',1,'']]], - ['remap_5f_325',['remap_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7846d77d4e620309c4948f67637a9dce',1,'cv::cudev::remap_(const SrcPtr &src, const MapPtr &map)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0dde1636c62b809cd4bf531ea429acfa',1,'cv::cudev::remap_(const SrcPtr &src, const MapXPtr &mapx, const MapYPtr &mapy)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7846d77d4e620309c4948f67637a9dce',1,'remap_(const SrcPtr &src, const MapPtr &map)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0dde1636c62b809cd4bf531ea429acfa',1,'remap_(const SrcPtr &src, const MapXPtr &mapx, const MapYPtr &mapy)(Global Namespace)']]], - ['remapping_326',['Remapping',['https://docs.opencv.org/4.2.0/d1/da0/tutorial_remap.html',1,'']]], - ['remapptr_327',['remapPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c0175ccc5581a982dc6c801f9ee81f9',1,'cv::cudev::remapPtr(const SrcPtr &src, const MapPtr &map)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65fadb00994fa6ccdbe3b17c1e742900',1,'cv::cudev::remapPtr(const SrcPtr &src, const MapXPtr &mapx, const MapYPtr &mapy)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c0175ccc5581a982dc6c801f9ee81f9',1,'remapPtr(const SrcPtr &src, const MapPtr &map)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65fadb00994fa6ccdbe3b17c1e742900',1,'remapPtr(const SrcPtr &src, const MapXPtr &mapx, const MapYPtr &mapy)(Global Namespace)']]], - ['remapptr1_328',['RemapPtr1',['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html',1,'cv::cudev']]], - ['remapptr1sz_329',['RemapPtr1Sz',['https://docs.opencv.org/4.2.0/dd/d03/structcv_1_1cudev_1_1RemapPtr1Sz.html',1,'cv::cudev']]], - ['remapptr2_330',['RemapPtr2',['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html',1,'cv::cudev']]], - ['remapptr2sz_331',['RemapPtr2Sz',['https://docs.opencv.org/4.2.0/d4/d59/structcv_1_1cudev_1_1RemapPtr2Sz.html',1,'cv::cudev']]], - ['remove_332',['remove',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#aef7392cdc72aafbd304abf42b15f98fb',1,'cv::gapi::GKernelPackage::remove(const GBackend &backend)'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#a3ec294d11a28bc25b8e4b60e94d67a1f',1,'cv::gapi::GKernelPackage::remove()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7e31cf919e63de611522d32e301e75b8',1,'list< __inp, __rebind_inp >::remove()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aa9b3162769904b5c710868fa13e9b8b9',1,'std::forward_list::remove()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7e31cf919e63de611522d32e301e75b8',1,'std::list::remove()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga166f118ed07d6a2dd58c9bbdd7c0f5b5',1,'std::remove()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga166f118ed07d6a2dd58c9bbdd7c0f5b5',1,'remove()(Global Namespace)']]], - ['remove_5fall_333',['remove_all',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#a5c23a1bc36782e9d9e58959e8ed1176e',1,'cv::utils::fs']]], - ['remove_5fall_5fextents_334',['remove_all_extents',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03519.html',1,'std']]], - ['remove_5fall_5fextents_5ft_335',['remove_all_extents_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga3bc0ff8d42850eabb6bcbe2440a844ff',1,'std::remove_all_extents_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga3bc0ff8d42850eabb6bcbe2440a844ff',1,'remove_all_extents_t(Global Namespace)']]], - ['remove_5fconst_336',['remove_const',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03919.html',1,'std']]], - ['remove_5fconst_5ft_337',['remove_const_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga4e79124b56e4ce8037d87387898b9d1f',1,'std::remove_const_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga4e79124b56e4ce8037d87387898b9d1f',1,'remove_const_t(Global Namespace)']]], - ['remove_5fcopy_338',['remove_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga6118d2d397ae6ad3b11604c6eb843a31',1,'std::remove_copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga6118d2d397ae6ad3b11604c6eb843a31',1,'remove_copy()(Global Namespace)']]], - ['remove_5fcopy_5fif_339',['remove_copy_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga80d825ff82bc980758c885296cec1fb1',1,'std::remove_copy_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga80d825ff82bc980758c885296cec1fb1',1,'remove_copy_if()(Global Namespace)']]], - ['remove_5fcv_340',['remove_cv',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03115.html',1,'std']]], - ['remove_5fcv_5ft_341',['remove_cv_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga33d8994a84545d04adc29f8be0d12122',1,'std::remove_cv_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga33d8994a84545d04adc29f8be0d12122',1,'remove_cv_t(Global Namespace)']]], - ['remove_5fextent_342',['remove_extent',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04143.html',1,'std']]], - ['remove_5fextent_5ft_343',['remove_extent_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#gaa9f31e8838657e142868524eca599817',1,'std::remove_extent_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#gaa9f31e8838657e142868524eca599817',1,'remove_extent_t(Global Namespace)']]], - ['remove_5fif_344',['remove_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ab31cebd10d04a7e69803d9cd55716213',1,'list< __inp, __rebind_inp >::remove_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a7c7f79f92d9199ce7245925b27621304',1,'std::forward_list::remove_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ab31cebd10d04a7e69803d9cd55716213',1,'std::list::remove_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga80cc02d9d8e0975b92933a90579b3678',1,'std::remove_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga80cc02d9d8e0975b92933a90579b3678',1,'remove_if(_ForwardIterator __first, _ForwardIterator __last, _Predicate __pred)(Global Namespace)']]], - ['remove_5fperms_345',['remove_perms',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145aa3ecbf595d87a84cbb691ea29ddb65ca',1,'remove_perms(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145aa3ecbf595d87a84cbb691ea29ddb65ca',1,'remove_perms(Global Namespace)']]], - ['remove_5fpointer_346',['remove_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04171.html',1,'std']]], - ['remove_5fpointer_5ft_347',['remove_pointer_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga46cd3040e1bdad121ab1668a69a662ff',1,'std::remove_pointer_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga46cd3040e1bdad121ab1668a69a662ff',1,'remove_pointer_t(Global Namespace)']]], - ['remove_5freference_348',['remove_reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03947.html',1,'std']]], - ['remove_5freference_5ft_349',['remove_reference_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga05f704b8440a5839204308c83a07748f',1,'std::remove_reference_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga05f704b8440a5839204308c83a07748f',1,'remove_reference_t(Global Namespace)']]], - ['remove_5fvolatile_350',['remove_volatile',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03927.html',1,'std']]], - ['remove_5fvolatile_5ft_351',['remove_volatile_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga7227cba5288e88d88468df26c3200885',1,'std::remove_volatile_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga7227cba5288e88d88468df26c3200885',1,'remove_volatile_t(Global Namespace)']]], - ['removealllights_352',['removeAllLights',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a5bc825156f2abd192f79dcbbaea359e7',1,'cv::viz::Viz3d']]], - ['removeallwidgets_353',['removeAllWidgets',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#aab9263b3b70b2f9ac00eec742a835d80',1,'cv::viz::Viz3d']]], - ['removechilds_354',['removeChilds',['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#afeeb32d2ff475a232e7a9f87762284d7',1,'cv::Node']]], - ['removedevicetelemetrycallback_355',['removeDeviceTelemetryCallback',['../namespacecan.html#a8a46628f8f55f509c3d745ba51814c80',1,'can']]], - ['removeduplicated_356',['removeDuplicated',['https://docs.opencv.org/4.2.0/de/db2/classcv_1_1KeyPointsFilter.html#ab037cbf3fd6d9e8d802aab77dc10395b',1,'cv::KeyPointsFilter']]], - ['removeduplicatedsorted_357',['removeDuplicatedSorted',['https://docs.opencv.org/4.2.0/de/db2/classcv_1_1KeyPointsFilter.html#a6f0da858c8fb8f8fab0ffd9a8c9109a5',1,'cv::KeyPointsFilter']]], - ['removeentity_358',['removeEntity',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a29ac46acd9d65da80cb3477a130b5f06',1,'cv::ovis::WindowScene']]], - ['removeevent_359',['removeEvent',['../classutil_1_1PeriodicScheduler.html#ad4ca024dc74ffdcf80fea87e5c17a516',1,'util::PeriodicScheduler']]], - ['removelimitswitchcallback_360',['removeLimitSwitchCallback',['../namespacecan_1_1motor.html#a7afd2bf689a9b364a2fb67216b940597',1,'can::motor']]], - ['removemessagehandler_361',['removeMessageHandler',['../classnet_1_1websocket_1_1WebSocketProtocol.html#a1cc6dd0a89dee979b539ad3afd250500',1,'net::websocket::WebSocketProtocol']]], - ['removenode_362',['removeNode',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a5adcb69ee679da35f74ea3a78594a692',1,'cv::SparseMat']]], - ['removeoutliers_363',['removeOutliers',['https://docs.opencv.org/4.2.0/dc/da7/classcv_1_1TrackerFeatureSet.html#a2492e86e9807cf68900387d5bee62e47',1,'cv::TrackerFeatureSet']]], - ['removewidget_364',['removeWidget',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a5a06f5a8b7bae5a518900afc4634acff',1,'cv::viz::Viz3d']]], - ['removing_20filter_365',['Periodic Noise Removing Filter',['https://docs.opencv.org/4.2.0/d2/d0b/tutorial_periodic_noise_removing_filter.html',1,'']]], - ['rend_366',['rend',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a08cc9cc1c8df58728f94b5533b643073',1,'__gnu_cxx::__versa_string::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aad836eb6a1c101e4a27defcaefb7e5cf',1,'__gnu_cxx::__versa_string::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< _CharT >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< _CharT >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< _CharT, _Traits, _Allocator >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< _CharT, _Traits, _Allocator >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< char >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< char >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< char_type, _Traits, _Alloc >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< char_type, _Traits, _Alloc >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< value_type >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< value_type >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0daef1995ab8473dad46086c79ecb9f0',1,'deque< _StateSeqT >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a2d4c0290323b6a5a78b2e30d2706d753',1,'deque< _StateSeqT >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4018c8137dc053cfd04641f1ab4b070e',1,'list< __inp, __rebind_inp >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#af134c3c02479d6b40c4b6dd9784ff9b2',1,'list< __inp, __rebind_inp >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'match_results< _Bi_iter >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'match_results< _Bi_iter >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'std::basic_string::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'std::basic_string::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0daef1995ab8473dad46086c79ecb9f0',1,'std::deque::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a2d4c0290323b6a5a78b2e30d2706d753',1,'std::deque::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4018c8137dc053cfd04641f1ab4b070e',1,'std::list::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#af134c3c02479d6b40c4b6dd9784ff9b2',1,'std::list::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#aa467231586b6bc6388765ec6802aef54',1,'std::map::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a21512c1e39cedc32e0275f89f888d4aa',1,'std::map::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'std::match_results::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'std::match_results::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a8852aeaaf83cf8effeacefd97b2c2889',1,'std::multimap::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a47926093ed08fe7fd770c81ef7bbdabd',1,'std::multimap::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a6ffe97a245a1f046e9b536c6d5511ac9',1,'std::multiset::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#afaa0621475cc933cf5a668a4db9fd851',1,'std::set::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'std::vector::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'std::vector::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< __diff_type >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< __diff_type >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _CharClassT >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _CharClassT >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _CharT >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _CharT >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _Cmpt >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _Cmpt >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _Node *, _Nodeptr_Alloc >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _Node *, _Nodeptr_Alloc >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _RealType >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _RealType >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _State< _TraitsT::char_type > >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _State< _TraitsT::char_type > >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _StringT >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _StringT >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< block_type, allocator_type >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< block_type, allocator_type >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< Catalog_info * >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< Catalog_info * >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< double >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< double >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< int >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< int >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< result_type >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< result_type >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< size_t >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< size_t >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< std::pair< _BiIter, int > >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< std::pair< _BiIter, int > >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< std::pair< _StateIdT, std::vector > >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< std::pair< _StateIdT, std::vector > >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< std::pair< _StrTransT, _StrTransT > >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< std::pair< _StrTransT, _StrTransT > >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< sub_match< _Bi_iter >, _Alloc >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< sub_match< _Bi_iter >, _Alloc >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< sub_match< _BiIter >, _Alloc >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< sub_match< _BiIter >, _Alloc >::rend() const noexcept'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'Eigen::VectorwiseOp::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'Eigen::VectorwiseOp::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const Derived, Horizontal >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const Derived, Horizontal >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const Derived, Vertical >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const Derived, Vertical >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::rend() const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a7a328b29b290cc300345376c54f618cb.html#a7a328b29b290cc300345376c54f618cb',1,'nlohmann::basic_json::rend() noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a2e4cbf41d593d41847b90aea55e5e84d.html#a2e4cbf41d593d41847b90aea55e5e84d',1,'nlohmann::basic_json::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac61454493a9b25de6eb36656e6e4213e',1,'std::rend(_Container &__cont) -> decltype(__cont.rend())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8d5191632dac9ebbb502815e5a96db58',1,'std::rend(const _Container &__cont) -> decltype(__cont.rend())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a77a0e2f60fbc43ae0c7ffd07b104558d',1,'std::rend(_Tp(&__arr)[_Nm])'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abf2be64d2e615a35f2357a527dbe4d6a',1,'std::rend(initializer_list< _Tp > __il)']]], - ['render_367',['render',['https://docs.opencv.org/4.2.0/d1/d20/classcv_1_1dynafu_1_1DynaFu.html#afd4ad03177fe105e6f3c1034b0ee944a',1,'cv::dynafu::DynaFu::render()'],['https://docs.opencv.org/4.2.0/d8/d1f/classcv_1_1kinfu_1_1KinFu.html#a5572d4402640210f1bc17e96a9824bea',1,'cv::kinfu::KinFu::render()'],['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a888b6963153283c6d0f22370d8144823',1,'cv::plot::Plot2d::render()'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#gaa315ba452961559eb9222d3ace8ce178',1,'cv::gapi::wip::draw::render(cv::Mat &bgr, const Prims &prims, cv::GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#ga10063407824d197cff1dd7221e9bed1c',1,'cv::gapi::wip::draw::render(cv::Mat &y_plane, cv::Mat &uv_plane, const Prims &prims, cv::GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga64c7a6323ba1b978f2f9142a4bad5ca1',1,'cv::ogl::render(const Texture2D &tex, Rect_< double > wndRect=Rect_< double >(0.0, 0.0, 1.0, 1.0), Rect_< double > texRect=Rect_< double >(0.0, 0.0, 1.0, 1.0))'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga0f86b878c8b65fe081fd4f7ac1e62110',1,'cv::ogl::render(const Arrays &arr, int mode=POINTS, Scalar color=Scalar::all(255))'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga090c1f371c37a575dea8b5c6371aec70',1,'cv::ogl::render(const Arrays &arr, InputArray indices, int mode=POINTS, Scalar color=Scalar::all(255))'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga64c7a6323ba1b978f2f9142a4bad5ca1',1,'render(const Texture2D &tex, Rect_< double > wndRect=Rect_< double >(0.0, 0.0, 1.0, 1.0), Rect_< double > texRect=Rect_< double >(0.0, 0.0, 1.0, 1.0))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga0f86b878c8b65fe081fd4f7ac1e62110',1,'render(const Arrays &arr, int mode=POINTS, Scalar color=Scalar::all(255))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga090c1f371c37a575dea8b5c6371aec70',1,'render(const Arrays &arr, InputArray indices, int mode=POINTS, Scalar color=Scalar::all(255))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#gaa315ba452961559eb9222d3ace8ce178',1,'render(cv::Mat &bgr, const Prims &prims, cv::GCompileArgs &&args={})(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#ga10063407824d197cff1dd7221e9bed1c',1,'render(cv::Mat &y_plane, cv::Mat &uv_plane, const Prims &prims, cv::GCompileArgs &&args={})(Global Namespace)']]], - ['render_2ehpp_368',['render.hpp',['https://docs.opencv.org/4.2.0/d1/dda/render_2render_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d4b/render_8hpp.html',1,'(Global Namespace)']]], - ['render3ch_369',['render3ch',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#gaa5b5b1b06d1e5653a96c692447a026c1',1,'cv::gapi::wip::draw::render3ch()'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#gaa5b5b1b06d1e5653a96c692447a026c1',1,'render3ch(const GMat &src, const GArray< Prim > &prims)(Global Namespace)']]], - ['rendering_370',['Non-Photorealistic Rendering',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html',1,'']]], - ['renderingproperties_371',['RenderingProperties',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gae4df8152c2d8639b915eccd0bb90f8ac',1,'cv::viz::RenderingProperties'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gae4df8152c2d8639b915eccd0bb90f8ac',1,'RenderingProperties(Global Namespace)']]], - ['rendermodes_372',['RenderModes',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#gaf53526c205a92260f356fe6589460aab',1,'cv::ogl::RenderModes'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#gaf53526c205a92260f356fe6589460aab',1,'RenderModes(Global Namespace)']]], - ['rendernv12_373',['renderNV12',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#ga35872fecb834a374ae66c36707dfc0b7',1,'cv::gapi::wip::draw::renderNV12()'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#ga35872fecb834a374ae66c36707dfc0b7',1,'renderNV12()(Global Namespace)']]], - ['rendersurface_374',['renderSurface',['https://docs.opencv.org/4.2.0/d1/d20/classcv_1_1dynafu_1_1DynaFu.html#a75ad62e354a745785a5133bad5b766de',1,'cv::dynafu::DynaFu']]], - ['reorglayer_375',['ReorgLayer',['https://docs.opencv.org/4.2.0/d6/da3/classcv_1_1dnn_1_1ReorgLayer.html',1,'cv::dnn']]], - ['repeat_376',['repeat',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga496c3860f3ac44c40b48811333cfda2d',1,'cv::repeat(InputArray src, int ny, int nx, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8e9c4ef56a85c58332c63997c10a51d8',1,'cv::repeat(const Mat &src, int ny, int nx)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga496c3860f3ac44c40b48811333cfda2d',1,'repeat(InputArray src, int ny, int nx, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8e9c4ef56a85c58332c63997c10a51d8',1,'repeat(const Mat &src, int ny, int nx)(Global Namespace)']]], - ['replace_377',['replace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab198c2154e2446b3800221546fa5c49a',1,'__gnu_cxx::__versa_string::replace(size_type __pos, size_type __n, const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2baedb7b7e66fa32852e1e5f7b03f839',1,'__gnu_cxx::__versa_string::replace(size_type __pos1, size_type __n1, const __versa_string &__str, size_type __pos2, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a3c9f1deec90a0bc60fd256a104da92ce',1,'__gnu_cxx::__versa_string::replace(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae54741e836d397dd56e21e5e62d1ccbf',1,'__gnu_cxx::__versa_string::replace(size_type __pos, size_type __n1, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#acc1eff3a64f7840cbef6f6fe3b5429f5',1,'__gnu_cxx::__versa_string::replace(size_type __pos, size_type __n1, size_type __n2, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2c79e5c619c0d549e5f014fc5e28b9a3',1,'__gnu_cxx::__versa_string::replace(const_iterator __i1, const_iterator __i2, const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a4a87e0419fea6c1548e867619a8544e4',1,'__gnu_cxx::__versa_string::replace(const_iterator __i1, const_iterator __i2, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aacd71b513fe378c6e44f7a85a9d9335b',1,'__gnu_cxx::__versa_string::replace(const_iterator __i1, const_iterator __i2, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#af5b9f5d9b9d4e6d8d3acedc2d9f8b113',1,'__gnu_cxx::__versa_string::replace(const_iterator __i1, const_iterator __i2, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a98e9ff42df6157eed9db5bfd9a7604ed',1,'__gnu_cxx::__versa_string::replace(const_iterator __i1, const_iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9ade44d5751cd139715d603036d24683',1,'__gnu_cxx::__versa_string::replace(const_iterator __i1, const_iterator __i2, std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'__gnu_debug::basic_string::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'__gnu_debug::basic_string::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'__gnu_debug::basic_string::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'__gnu_debug::basic_string::replace(iterator __i1, iterator __i2, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'__gnu_debug::basic_string::replace(iterator __i1, iterator __i2, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'__gnu_debug::basic_string::replace(iterator __i1, iterator __i2, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'__gnu_debug::basic_string::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'__gnu_debug::basic_string::replace(iterator __i1, iterator __i2, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< _CharT >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< _CharT >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< _CharT >::replace(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< _CharT >::replace(size_type __pos, size_type __n1, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< _CharT >::replace(size_type __pos, size_type __n1, size_type __n2, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< _CharT >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< _CharT >::replace(iterator __i1, iterator __i2, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< _CharT >::replace(iterator __i1, iterator __i2, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< _CharT >::replace(iterator __i1, iterator __i2, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< _CharT >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< _CharT >::replace(iterator __i1, iterator __i2, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< _CharT, _Traits, _Allocator >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< _CharT, _Traits, _Allocator >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< _CharT, _Traits, _Allocator >::replace(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< _CharT, _Traits, _Allocator >::replace(size_type __pos, size_type __n1, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< _CharT, _Traits, _Allocator >::replace(size_type __pos, size_type __n1, size_type __n2, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< _CharT, _Traits, _Allocator >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< _CharT, _Traits, _Allocator >::replace(iterator __i1, iterator __i2, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< _CharT, _Traits, _Allocator >::replace(iterator __i1, iterator __i2, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< _CharT, _Traits, _Allocator >::replace(iterator __i1, iterator __i2, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< _CharT, _Traits, _Allocator >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< _CharT, _Traits, _Allocator >::replace(iterator __i1, iterator __i2, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(size_type __pos, size_type __n1, const _Elem *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(size_type __pos, size_type __n1, const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(size_type __pos, size_type __n1, size_type __n2, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(iterator __i1, iterator __i2, const _Elem *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(iterator __i1, iterator __i2, const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(iterator __i1, iterator __i2, size_type __n, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(iterator __i1, iterator __i2, initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< char >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< char >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< char >::replace(size_type __pos, size_type __n1, const char *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< char >::replace(size_type __pos, size_type __n1, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< char >::replace(size_type __pos, size_type __n1, size_type __n2, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< char >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< char >::replace(iterator __i1, iterator __i2, const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< char >::replace(iterator __i1, iterator __i2, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< char >::replace(iterator __i1, iterator __i2, size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< char >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< char >::replace(iterator __i1, iterator __i2, initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(size_type __pos, size_type __n1, const char *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(size_type __pos, size_type __n1, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(size_type __pos, size_type __n1, size_type __n2, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(iterator __i1, iterator __i2, const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(iterator __i1, iterator __i2, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(iterator __i1, iterator __i2, size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(iterator __i1, iterator __i2, initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< char_type, _Traits, _Alloc >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< char_type, _Traits, _Alloc >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< char_type, _Traits, _Alloc >::replace(size_type __pos, size_type __n1, const char_type *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< char_type, _Traits, _Alloc >::replace(size_type __pos, size_type __n1, const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< char_type, _Traits, _Alloc >::replace(size_type __pos, size_type __n1, size_type __n2, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< char_type, _Traits, _Alloc >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< char_type, _Traits, _Alloc >::replace(iterator __i1, iterator __i2, const char_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< char_type, _Traits, _Alloc >::replace(iterator __i1, iterator __i2, const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< char_type, _Traits, _Alloc >::replace(iterator __i1, iterator __i2, size_type __n, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< char_type, _Traits, _Alloc >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< char_type, _Traits, _Alloc >::replace(iterator __i1, iterator __i2, initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< value_type >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< value_type >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< value_type >::replace(size_type __pos, size_type __n1, const value_type *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< value_type >::replace(size_type __pos, size_type __n1, const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< value_type >::replace(size_type __pos, size_type __n1, size_type __n2, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< value_type >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< value_type >::replace(iterator __i1, iterator __i2, const value_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< value_type >::replace(iterator __i1, iterator __i2, const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< value_type >::replace(iterator __i1, iterator __i2, size_type __n, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< value_type >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< value_type >::replace(iterator __i1, iterator __i2, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'std::basic_string::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'std::basic_string::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'std::basic_string::replace(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'std::basic_string::replace(size_type __pos, size_type __n1, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'std::basic_string::replace(size_type __pos, size_type __n1, size_type __n2, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'std::basic_string::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'std::basic_string::replace(iterator __i1, iterator __i2, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'std::basic_string::replace(iterator __i1, iterator __i2, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'std::basic_string::replace(iterator __i1, iterator __i2, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'std::basic_string::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'std::basic_string::replace(iterator __i1, iterator __i2, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga77aa7f436223611f545f84715a30ffeb',1,'std::replace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga77aa7f436223611f545f84715a30ffeb',1,'replace()(Global Namespace)']]], - ['replace_5fcopy_378',['replace_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a306bbe037bd6196bbe5e9c78b1108d13',1,'std']]], - ['replace_5fcopy_5fif_379',['replace_copy_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaf42cb56a0d7dfd9124bddc4194cb53a4',1,'std::replace_copy_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaf42cb56a0d7dfd9124bddc4194cb53a4',1,'replace_copy_if()(Global Namespace)']]], - ['replace_5fif_380',['replace_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga0afa1177a761d23ec3ec965207144455',1,'std::replace_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga0afa1177a761d23ec3ec965207144455',1,'replace_if()(Global Namespace)']]], - ['replace_5fminimal_5fn_381',['replace_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a524589fca5b42e749dd5d5c2561fdacd',1,'__gnu_parallel::_Settings']]], - ['replaceclassifierstatistic_382',['replaceClassifierStatistic',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html#a9ed60a99317d6044cbca77a6ef9ee2ec',1,'cv::BaseClassifier']]], - ['replaceweakclassifier_383',['replaceWeakClassifier',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html#a31742fc5d120c07cba942c1baf4d2529',1,'cv::BaseClassifier::replaceWeakClassifier()'],['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html#ab518bccdfb6abb4c85319f67829b55c5',1,'cv::StrongClassifierDirectSelection::replaceWeakClassifier()']]], - ['replicate_384',['Replicate',['https://eigen.tuxfamily.org/dox/classEigen_1_1Replicate.html',1,'Eigen']]], - ['replicate_385',['replicate',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a60dadfe80b813d808e91e4521c722a8e',1,'Eigen::DenseBase::replicate() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#afae2d5e36f1158d1b1681dac3cdbd58e',1,'Eigen::DenseBase::replicate(Index rowFactor, Index colFactor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a60dadfe80b813d808e91e4521c722a8e',1,'DenseBase< ArrayWrapper< ExpressionType > >::replicate() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#afae2d5e36f1158d1b1681dac3cdbd58e',1,'DenseBase< ArrayWrapper< ExpressionType > >::replicate(Index rowFactor, Index colFactor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a60dadfe80b813d808e91e4521c722a8e',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::replicate() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#afae2d5e36f1158d1b1681dac3cdbd58e',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::replicate(Index rowFactor, Index colFactor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a60dadfe80b813d808e91e4521c722a8e',1,'DenseBase< Solve< Decomposition, RhsType > >::replicate() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#afae2d5e36f1158d1b1681dac3cdbd58e',1,'DenseBase< Solve< Decomposition, RhsType > >::replicate(Index rowFactor, Index colFactor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'Eigen::VectorwiseOp::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'Eigen::VectorwiseOp::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const Derived, Horizontal >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const Derived, Horizontal >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const Derived, Vertical >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const Derived, Vertical >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::replicate(Index factor=Factor) const']]], - ['representation_386',['REPRESENTATION',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca36a301be1668d029901f94cd3226d802',1,'cv::viz::REPRESENTATION'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca36a301be1668d029901f94cd3226d802',1,'REPRESENTATION(Global Namespace)']]], - ['representation_5fpoints_387',['REPRESENTATION_POINTS',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gga4b33d8c74317eb777b20accb8fe2ce4caa96f1fac6585f2154df245cd9be07e78',1,'cv::viz::REPRESENTATION_POINTS'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gga4b33d8c74317eb777b20accb8fe2ce4caa96f1fac6585f2154df245cd9be07e78',1,'REPRESENTATION_POINTS(Global Namespace)']]], - ['representation_5fsurface_388',['REPRESENTATION_SURFACE',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gga4b33d8c74317eb777b20accb8fe2ce4ca5d5672bade6a20e704b087cb19c5009a',1,'cv::viz::REPRESENTATION_SURFACE'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gga4b33d8c74317eb777b20accb8fe2ce4ca5d5672bade6a20e704b087cb19c5009a',1,'REPRESENTATION_SURFACE(Global Namespace)']]], - ['representation_5fwireframe_389',['REPRESENTATION_WIREFRAME',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gga4b33d8c74317eb777b20accb8fe2ce4cad9e6a89e8d3a8e2c7d4d0af09047e07d',1,'cv::viz::REPRESENTATION_WIREFRAME'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gga4b33d8c74317eb777b20accb8fe2ce4cad9e6a89e8d3a8e2c7d4d0af09047e07d',1,'REPRESENTATION_WIREFRAME(Global Namespace)']]], - ['representationvalues_390',['RepresentationValues',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ga4b33d8c74317eb777b20accb8fe2ce4c',1,'cv::viz::RepresentationValues'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ga4b33d8c74317eb777b20accb8fe2ce4c',1,'RepresentationValues(Global Namespace)']]], - ['reproject_391',['reproject',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1face_1_1FacemarkLBF_1_1BBox.html#a16c8be68bb61d6c3d48d0addbf2ac2fe',1,'cv::face::FacemarkLBF::BBox']]], - ['reprojectimageto3d_392',['reprojectImageTo3D',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga1bc1152bd57d63bc524204f21fde6e02',1,'cv::reprojectImageTo3D()'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#gaff851e3932da0f3e74d1be1d8855f094',1,'cv::cuda::reprojectImageTo3D()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga1bc1152bd57d63bc524204f21fde6e02',1,'reprojectImageTo3D(InputArray disparity, OutputArray _3dImage, InputArray Q, bool handleMissingValues=false, int ddepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#gaff851e3932da0f3e74d1be1d8855f094',1,'reprojectImageTo3D(InputArray disp, OutputArray xyzw, InputArray Q, int dst_cn=4, Stream &stream=Stream::Null())(Global Namespace)']]], - ['requested_5fsize_393',['requested_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a6cc6bd1d6df0b852168f5065c01433ca',1,'__gnu_cxx::temporary_buffer::requested_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a6cc6bd1d6df0b852168f5065c01433ca',1,'std::_Temporary_buffer::requested_size()']]], - ['require_5finput_5fiter_394',['require_input_iter',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a89cc338e8466e74baaa138664c79ee98.html#a89cc338e8466e74baaa138664c79ee98',1,'nlohmann::ordered_map']]], - ['rescaledepth_395',['rescaleDepth',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gad02260251f8486bba19f126139c12e3b',1,'cv::rgbd::rescaleDepth()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gad02260251f8486bba19f126139c12e3b',1,'rescaleDepth()(Global Namespace)']]], - ['reserve_396',['reserve',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a0706ed6c42e288926c5ad415b976bbe2',1,'cv::Mat::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aec0611cbd406403c883086089c95a512',1,'__gnu_cxx::__versa_string::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'__gnu_debug::basic_string::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< _CharT >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< _CharT, _Traits, _Allocator >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< char >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< char, char_traits< char >, _Byte_alloc >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< char_type, _Traits, _Alloc >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< value_type >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'match_results< _Bi_iter >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'std::basic_string::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'std::match_results::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2eee23bd13796426f3018c8a9341202f',1,'std::unordered_map::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a9167538c4058279e45627d0a68f3d030',1,'std::unordered_multimap::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aad33b09815e29fc00dba2408e91e3ed6',1,'std::unordered_multiset::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#aeb44171c81ee124bbb21a113ff318530',1,'std::unordered_set::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'std::vector::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2eee23bd13796426f3018c8a9341202f',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< __diff_type >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _CharClassT >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _CharT >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _Cmpt >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _Node *, _Nodeptr_Alloc >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _RealType >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _State< _TraitsT::char_type > >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _StringT >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< block_type, allocator_type >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< Catalog_info * >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< double >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< int >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< result_type >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< size_t >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< std::pair< _BiIter, int > >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< std::pair< _StateIdT, std::vector > >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< std::pair< _StrTransT, _StrTransT > >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< sub_match< _Bi_iter >, _Alloc >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< sub_match< _BiIter >, _Alloc >::reserve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2b219eb36fbab0bfae535cfbfc74a76',1,'Eigen::SparseMatrix::reserve(const SizesType &reserveSizes)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1518e58ac49bed0e2385b722a034f7d3',1,'Eigen::SparseMatrix::reserve(Index reserveSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2b219eb36fbab0bfae535cfbfc74a76',1,'SparseMatrix< Scalar >::reserve(const SizesType &reserveSizes)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1518e58ac49bed0e2385b722a034f7d3',1,'SparseMatrix< Scalar >::reserve(Index reserveSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2b219eb36fbab0bfae535cfbfc74a76',1,'SparseMatrix< Scalar, ColMajor, int >::reserve(const SizesType &reserveSizes)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1518e58ac49bed0e2385b722a034f7d3',1,'SparseMatrix< Scalar, ColMajor, int >::reserve(Index reserveSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2b219eb36fbab0bfae535cfbfc74a76',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::reserve(const SizesType &reserveSizes)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1518e58ac49bed0e2385b722a034f7d3',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::reserve(Index reserveSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2b219eb36fbab0bfae535cfbfc74a76',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::reserve(const SizesType &reserveSizes)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1518e58ac49bed0e2385b722a034f7d3',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::reserve(Index reserveSize)']]], - ['reservebuffer_397',['reserveBuffer',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a923eead22fe7f0c48aa000158df920f3',1,'cv::Mat']]], - ['reset_398',['reset',['https://docs.opencv.org/4.2.0/d1/d20/classcv_1_1dynafu_1_1DynaFu.html#a1dca408d6eab13eb4449c7feaa10d185',1,'cv::dynafu::DynaFu::reset()'],['https://docs.opencv.org/4.2.0/d4/df3/classcv_1_1Formatted.html#a2519cc8dfbf00321adb105fe3aed5d92',1,'cv::Formatted::reset()'],['https://docs.opencv.org/4.2.0/d4/dd6/classcv_1_1superres_1_1FrameSource.html#a87870160d68199b12b89e827f1af6fc6',1,'cv::superres::FrameSource::reset()'],['https://docs.opencv.org/4.2.0/d1/d81/classcv_1_1videostab_1_1IFrameSource.html#a4aca86a6810f2330f4934db4dce65822',1,'cv::videostab::IFrameSource::reset()'],['https://docs.opencv.org/4.2.0/d8/d1f/classcv_1_1kinfu_1_1KinFu.html#ac784d8e5a9379fbb64ac98278c3e2ca8',1,'cv::kinfu::KinFu::reset()'],['https://docs.opencv.org/4.2.0/da/d26/classcv_1_1videostab_1_1MaskFrameSource.html#af2708078e236b8ac406faca6b8bef50a',1,'cv::videostab::MaskFrameSource::reset()'],['https://docs.opencv.org/4.2.0/dd/d5b/classcv_1_1videostab_1_1NullFrameSource.html#a1d35b1f331c32f929f28e59969d23ba9',1,'cv::videostab::NullFrameSource::reset()'],['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#ad6f34069d0bdd8dab0cb47035a5307d9',1,'cv::videostab::OnePassStabilizer::reset()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a431117c910e3d0bae5757e3cacc65b60',1,'cv::util::optional::reset()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a0a04c12c0db40651f58cec47f091117a',1,'cv::videostab::StabilizerBase::reset()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#abf79128e553d3460d47d1ca0f26f5376',1,'cv::superres::SuperResolution::reset()'],['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html#ac9a8a593b4bd1c4ea6a1076c735260dd',1,'cv::TickMeter::reset()'],['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a2241168940d3b7f2a8496db2ca41da52',1,'cv::videostab::TwoPassStabilizer::reset()'],['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html#a10dd3ec812bac4d93150e1b58d8cbf19',1,'cv::detail::VectorRef::reset()'],['https://docs.opencv.org/4.2.0/d2/dab/classcv_1_1detail_1_1VectorRefT.html#ac305147bc57001546f8d8d1c6131cc1e',1,'cv::detail::VectorRefT::reset()'],['https://docs.opencv.org/4.2.0/da/d0b/classcv_1_1videostab_1_1VideoFileSource.html#a7dae5c70dbb2829643ffb84576c5eb5d',1,'cv::videostab::VideoFileSource::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a305329ded629d15f8ff5f84d642357f9',1,'gamma_distribution< double >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a305329ded629d15f8ff5f84d642357f9',1,'gamma_distribution< result_type >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a757217130ef7b0eb980500afc8bd865c',1,'normal_distribution< double >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a757217130ef7b0eb980500afc8bd865c',1,'normal_distribution< result_type >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a7d9519c9b72d8add8292661b822ab7fe',1,'std::auto_ptr::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#a0e2d60fd13c2709af0294ab028e0646a',1,'std::bernoulli_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#acac7f32aa4a2b3ac2e512c5097aa70dc',1,'std::binomial_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a74ba5bc37dd7a687b8f05883e076f3bd',1,'std::bitset::reset() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#af4c2e2cef691e173dca06e743dce31fa',1,'std::bitset::reset(size_t __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#aa71463201b987ecaf218767aeaf9f8e8',1,'std::cauchy_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a97c1963c5d5cab27292ba7233cb54b5e',1,'std::chi_squared_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a42f8e4f291038ca9a9d1057f58d506d3',1,'std::discrete_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a1d72f5ccd6ee769af3d8cc82ed350e99',1,'std::exponential_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#a31f27dfe6c4727fb924d04ab3450fa14',1,'std::extreme_value_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a1a8ed43ea1042c8a502c4d497cff95a8',1,'std::fisher_f_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a305329ded629d15f8ff5f84d642357f9',1,'std::gamma_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#ad170e9c049fc1d5df02da5097eda29df',1,'std::geometric_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#aad743c49b0d74f10dd9831daf56792a4',1,'std::lognormal_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#afb3d4cc6b63de72f9bbcf9f1f630f1d8',1,'std::negative_binomial_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a757217130ef7b0eb980500afc8bd865c',1,'std::normal_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a4ce6dad62329546bb55d810817c332b2',1,'std::piecewise_constant_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a8fe3e119433b9e32abad358259e295cc',1,'std::piecewise_linear_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a22ecafd7d767621e777f6e8e556ff453',1,'std::poisson_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a48d5f501c9847b3688480efece2a0f8c',1,'std::student_t_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a506b883f52467029cd9245e063730156',1,'std::tr2::dynamic_bitset::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a7882b9f8c437599fc24e0e01e5346af2',1,'std::tr2::dynamic_bitset::reset(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a0a3d8e2f31efa9279eae703aef76632c',1,'std::uniform_int_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#a32de9a167158ce4d66cf0b07296a13c8',1,'std::uniform_real_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0922a8f5a7c082e9495e43a0fab365da',1,'std::unique_ptr::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a4d205b7ff644487394c5bce1cbf6a6ac',1,'std::unique_ptr< _Tp[], _Dp >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a3c2c5842081debd56978c362bdbe9fda',1,'std::weibull_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0922a8f5a7c082e9495e43a0fab365da',1,'unique_ptr< _Codecvt >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0922a8f5a7c082e9495e43a0fab365da',1,'unique_ptr< _Res_type >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0922a8f5a7c082e9495e43a0fab365da',1,'unique_ptr< _Result< _Res > >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0922a8f5a7c082e9495e43a0fab365da',1,'unique_ptr< _Result_base >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0922a8f5a7c082e9495e43a0fab365da',1,'unique_ptr< bool[]>::reset()'],['../classcontrol_1_1JacobianPosController.html#a98412d8f0683607aa781d1f6e0617382',1,'control::JacobianPosController::reset()'],['../classJacobianVelController.html#ae7290ed4e0d2188461768ee9242e5c52',1,'JacobianVelController::reset()'],['../classcontrol_1_1PIDController.html#a391a6167a7d5fa3653d42f9f1c55ae1b',1,'control::PIDController::reset()'],['../classcontrol_1_1TrapezoidalVelocityProfile.html#ab46ea8c35445ed8d240368862e454bae',1,'control::TrapezoidalVelocityProfile::reset()'],['../classcontrol_1_1SingleDimTrapezoidalVelocityProfile.html#a4aa38b4e4ade9f91ef100124f41cc412',1,'control::SingleDimTrapezoidalVelocityProfile::reset()'],['../classfilters_1_1KalmanFilterBase.html#ac3e13d231843250d4f7e046c0fc4a8e9',1,'filters::KalmanFilterBase::reset()'],['../classfilters_1_1KalmanFilterBase.html#a7a0b8fc99ca7045a6c463bdba0d50134',1,'filters::KalmanFilterBase::reset(const Eigen::Matrix< double, stateDim, 1 > &state)'],['../classfilters_1_1KalmanFilterBase.html#a2b6c3add0c00eb69d4b9e8b70b4fecf3',1,'filters::KalmanFilterBase::reset(const Eigen::Matrix< double, stateDim, 1 > &state, const Eigen::Matrix< double, stateDim, 1 > &stdDevs)'],['../classfilters_1_1KalmanFilterBase.html#aabc156912cdbd42c559806bc25999196',1,'filters::KalmanFilterBase::reset(const Eigen::Matrix< double, stateDim, 1 > &state, const Eigen::Matrix< double, stateDim, stateDim > &estCovMat)'],['../classfilters_1_1RollingAvgFilter.html#a6f526515c51fff61123214def1a12b2a',1,'filters::RollingAvgFilter::reset()']]], - ['reset_5fscratch_399',['reset_scratch',['https://docs.opencv.org/4.2.0/d4/d77/structcv_1_1detail_1_1FluidCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_16cb3b081e952d44068dce53ded07afdc.html#a314fb3bfc854d9c10d1fdcc67edc2834',1,'cv::detail::FluidCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... >, UseScratch >']]], - ['resetcamera_400',['resetCamera',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a836d8684b8bd36aea09706fff4d6c0d6',1,'cv::viz::Viz3d']]], - ['resetcameraviewpoint_401',['resetCameraViewpoint',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a4c98ec028511f60527959afafb73c75c',1,'cv::viz::Viz3d']]], - ['resetcolorarray_402',['resetColorArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a312b67d3fea28ee6fdcfbf2184bfee1b',1,'cv::ogl::Arrays']]], - ['resetdevice_403',['resetDevice',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga6153b6f461101374e655a54fc77e725e',1,'cv::cuda::resetDevice()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga6153b6f461101374e655a54fc77e725e',1,'resetDevice()(Global Namespace)']]], - ['resetiosflags_404',['resetiosflags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a12ef9b47a80c8f0606aa34dab5477524',1,'std']]], - ['resetmyriaddevice_405',['resetMyriadDevice',['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a845954e233d408c56911db34bf8a800c',1,'cv::dnn']]], - ['resetnormalarray_406',['resetNormalArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a26cd068ff065960cd3fc7d99bcf005b7',1,'cv::ogl::Arrays']]], - ['resetpeakusage_407',['resetPeakUsage',['https://docs.opencv.org/4.2.0/df/d6f/classcv_1_1utils_1_1AllocatorStatisticsInterface.html#a224175e57f5cd7814e8fcdca2b76e496',1,'cv::utils::AllocatorStatisticsInterface']]], - ['resettexcoordarray_408',['resetTexCoordArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a30cbc94c7a8e9c4dbbe0ad2699a51638',1,'cv::ogl::Arrays']]], - ['resettrace_409',['resetTrace',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a2bfb5e5c8e5f5d81aa19dfe8b168863e',1,'cv::instr']]], - ['resettracking_410',['resetTracking',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ac5069e92d25b70eb15ca31d856f70ef8',1,'cv::DetectionBasedTracker']]], - ['resetvertexarray_411',['resetVertexArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a3bae2d1d0a047f4f2b14fb229ccba87c',1,'cv::ogl::Arrays']]], - ['reshape_412',['reshape',['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ae51d8dbce56c9804e6eb9440c811ba44',1,'cv::GCompiled::reshape()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a408e22ed824d1ddf59f58bda895017a8',1,'cv::cuda::GpuMat::reshape()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a31e3165f8fc1a4863d7a67a973f5bd68',1,'cv::cuda::HostMem::reshape()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a4eb96e3251417fa88b78e2abd6cfd7d8',1,'cv::Mat::reshape(int cn, int rows=0) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a50e606fe51f53b896b66051634a018fb',1,'cv::Mat::reshape(int cn, int newndims, const int *newsz) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ab2e41a510891e548f744832cf9b8ab89',1,'cv::Mat::reshape(int cn, const std::vector< int > &newshape) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'cv::Matx::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< _Tp, cn, 1 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, 1, 3 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, 2, 2 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, 2, 3 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, 3, 3 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, 3, 4 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, 4, 4 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, cn, 1 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< float, 2, 3 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< float, 3, 3 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< float, cn, 1 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< float_type, 4, 4 >::reshape()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a25ac687266568c8b024debd187c15b9b',1,'cv::UMat::reshape(int cn, int rows=0) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ac166eaa6eccbeb2f5e9ce593ee156ef4',1,'cv::UMat::reshape(int cn, int newndims, const int *newsz) const']]], - ['reshape_413',['Reshape',['https://eigen.tuxfamily.org/dox/group__TutorialReshape.html',1,'']]], - ['reshape_5f_414',['reshape_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8d3afd333e85d069621e002238050d9',1,'cv::cudev::reshape_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8d3afd333e85d069621e002238050d9',1,'reshape_()(Global Namespace)']]], - ['reshaped_415',['Reshaped',['https://eigen.tuxfamily.org/dox/classEigen_1_1Reshaped.html',1,'Eigen::Reshaped< class, Rows, Cols, Order >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Reshaped.html#a6de25b03b93cb3dc55ba7fcafae87984',1,'Eigen::Reshaped::Reshaped(XprType &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Reshaped.html#a26f25c9bc61d72ae9db5d62112d4a26a',1,'Eigen::Reshaped::Reshaped(XprType &xpr, Index reshapeRows, Index reshapeCols)']]], - ['reshapelayer_416',['ReshapeLayer',['https://docs.opencv.org/4.2.0/db/d15/classcv_1_1dnn_1_1ReshapeLayer.html',1,'cv::dnn']]], - ['residual_417',['residual',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#ae1447eb1b9f10cfadadd2b1f2ec4f2c2',1,'cv::ppf_match_3d::Pose3D']]], - ['resimheight_418',['resImHeight',['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#a46088d05127021270b1c50849b7cda92',1,'cv::saliency::StaticSaliencySpectralResidual']]], - ['resimwidth_419',['resImWidth',['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#acfea65febba2693babafb11a63150f42',1,'cv::saliency::StaticSaliencySpectralResidual']]], - ['resize_420',['resize',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#ae8e150ecf6dbac7605fd7e8ad4cc7d01',1,'cv::TrackerKCF::Params::resize'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a97edc51af209cd6ab20da864c3468124',1,'cv::AutoBuffer::resize()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a97edc51af209cd6ab20da864c3468124',1,'AutoBuffer< double, 1 >::resize()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a97edc51af209cd6ab20da864c3468124',1,'AutoBuffer< int64, 1 >::resize()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a97edc51af209cd6ab20da864c3468124',1,'AutoBuffer< String, 1 >::resize()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ad0127b138acfcc2dcd5dafc51175b309',1,'cv::Mat::resize(size_t sz)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#abdbf4852beb3af95977fa289f6c7034c',1,'cv::Mat::resize(size_t sz, const Scalar &s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a71062fb582528519cd66bbe96a89be13',1,'__gnu_cxx::__versa_string::resize(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aab92cb1d9ba7c14d17cbf4a6a6578bbd',1,'__gnu_cxx::__versa_string::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11175.html#aa602ba7bfa4925ea84591734c68d49e2',1,'__gnu_pbds::hash_standard_resize_policy::resize()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< _CharT >::resize(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< _CharT >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< _CharT, _Traits, _Allocator >::resize(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< _CharT, _Traits, _Allocator >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::resize(size_type __n, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< char >::resize(size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< char >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< char, char_traits< char >, _Byte_alloc >::resize(size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< char, char_traits< char >, _Byte_alloc >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< char_type, _Traits, _Alloc >::resize(size_type __n, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< char_type, _Traits, _Alloc >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< value_type >::resize(size_type __n, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< value_type >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a2cb09fae5538690a6175b6e738f39b59',1,'deque< _StateSeqT >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5f7f1a01f2d6a06b4c89a4c5a84a9002',1,'deque< _StateSeqT >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a06a57b2ab785e15264e7f36742c4b0dc',1,'list< __inp, __rebind_inp >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a235d2bb37c9a5d9323c123ebd060cebc',1,'list< __inp, __rebind_inp >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'match_results< _Bi_iter >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'match_results< _Bi_iter >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'std::basic_string::resize(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'std::basic_string::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a2cb09fae5538690a6175b6e738f39b59',1,'std::deque::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5f7f1a01f2d6a06b4c89a4c5a84a9002',1,'std::deque::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a73ffca07b591237200b852caf7040057',1,'std::forward_list::resize(size_type __sz)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#abfb248e17d0392a8caf5c46683102332',1,'std::forward_list::resize(size_type __sz, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a06a57b2ab785e15264e7f36742c4b0dc',1,'std::list::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a235d2bb37c9a5d9323c123ebd060cebc',1,'std::list::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'std::match_results::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'std::match_results::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a3e0c1dfb374af7a457d5e74d04b37b95',1,'std::tr2::dynamic_bitset::resize()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f9fdb05edd4a7364dec8a5e9ae2a0bb',1,'std::valarray::resize()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'std::vector::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'std::vector::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f9fdb05edd4a7364dec8a5e9ae2a0bb',1,'valarray< size_t >::resize()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< __diff_type >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< __diff_type >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _CharClassT >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _CharClassT >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _CharT >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _CharT >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _Cmpt >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _Cmpt >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _Node *, _Nodeptr_Alloc >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _Node *, _Nodeptr_Alloc >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _RealType >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _RealType >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _State< _TraitsT::char_type > >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _State< _TraitsT::char_type > >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _StringT >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _StringT >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< block_type, allocator_type >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< block_type, allocator_type >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< Catalog_info * >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< Catalog_info * >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< double >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< double >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< int >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< int >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< result_type >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< result_type >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< size_t >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< size_t >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< std::pair< _BiIter, int > >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< std::pair< _BiIter, int > >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< std::pair< _StateIdT, std::vector > >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< std::pair< _StateIdT, std::vector > >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< std::pair< _StrTransT, _StrTransT > >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< std::pair< _StrTransT, _StrTransT > >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< sub_match< _Bi_iter >, _Alloc >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< sub_match< _Bi_iter >, _Alloc >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< sub_match< _BiIter >, _Alloc >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< sub_match< _BiIter >, _Alloc >::resize(size_type __new_size, const value_type &__x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayWrapper.html#a1dff702690e4d5795b3d08c5c6c1d082',1,'Eigen::ArrayWrapper::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayWrapper.html#a1c5e643b7dc161066754e0812d57c4f1',1,'Eigen::ArrayWrapper::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2ec5bac4e1ab95808808ef50ccf4cb39',1,'Eigen::DenseBase::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a25e2b4887b47b1f2346857d1931efa0f',1,'Eigen::DenseBase::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2ec5bac4e1ab95808808ef50ccf4cb39',1,'DenseBase< ArrayWrapper< ExpressionType > >::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a25e2b4887b47b1f2346857d1931efa0f',1,'DenseBase< ArrayWrapper< ExpressionType > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2ec5bac4e1ab95808808ef50ccf4cb39',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a25e2b4887b47b1f2346857d1931efa0f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2ec5bac4e1ab95808808ef50ccf4cb39',1,'DenseBase< Solve< Decomposition, RhsType > >::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a25e2b4887b47b1f2346857d1931efa0f',1,'DenseBase< Solve< Decomposition, RhsType > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#af04e2fd5733eda42f0d82bb6b7405b42',1,'Eigen::DiagonalMatrix::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixWrapper.html#a1712f7e4840af7950ff480aa2efe1b8f',1,'Eigen::MatrixWrapper::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixWrapper.html#a41d991d9d3e380c88c2d7f1051c8d3f4',1,'Eigen::MatrixWrapper::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a0e0fda6e84d69e02432e4770359bb532',1,'Eigen::PermutationBase::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a0e0fda6e84d69e02432e4770359bb532',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a0e0fda6e84d69e02432e4770359bb532',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a0e0fda6e84d69e02432e4770359bb532',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a0e0fda6e84d69e02432e4770359bb532',1,'PermutationBase< PermutationWrapper< _IndicesType > >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'Eigen::PlainObjectBase::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'Eigen::PlainObjectBase::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'Eigen::PlainObjectBase::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'Eigen::PlainObjectBase::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af88551f30202341b7cc24cfadabdec5c',1,'Eigen::SparseMatrix::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af88551f30202341b7cc24cfadabdec5c',1,'SparseMatrix< Scalar >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af88551f30202341b7cc24cfadabdec5c',1,'SparseMatrix< Scalar, ColMajor, int >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af88551f30202341b7cc24cfadabdec5c',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af88551f30202341b7cc24cfadabdec5c',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#a9b42c595fd4df10700260dc71887ecd2',1,'Eigen::SparseVector::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#a2ea1091874a71c8511be8a21bf238f5a',1,'Eigen::SparseVector::resize(Index rows, Index cols)'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga47a974309e9102f5f08231edc7e7529d',1,'cv::resize()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga4f5fa0770d1c9efbadb9be1b92a6452a',1,'cv::cuda::resize()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gad0ae87ad8b909c3c11a07b007837be8b',1,'cv::gapi::resize()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga2fe39d2201b12e1b961ca56b2aff9ff2',1,'cv::hal::resize()'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga47a974309e9102f5f08231edc7e7529d',1,'resize(InputArray src, OutputArray dst, Size dsize, double fx=0, double fy=0, int interpolation=INTER_LINEAR)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga2fe39d2201b12e1b961ca56b2aff9ff2',1,'resize(int src_type, const uchar *src_data, size_t src_step, int src_width, int src_height, uchar *dst_data, size_t dst_step, int dst_width, int dst_height, double inv_scale_x, double inv_scale_y, int interpolation)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gad0ae87ad8b909c3c11a07b007837be8b',1,'resize(const GMat &src, const Size &dsize, double fx=0, double fy=0, int interpolation=INTER_LINEAR)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga4f5fa0770d1c9efbadb9be1b92a6452a',1,'resize(InputArray src, OutputArray dst, Size dsize, double fx=0, double fy=0, int interpolation=INTER_LINEAR, Stream &stream=Stream::Null())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f9fdb05edd4a7364dec8a5e9ae2a0bb',1,'resize(size_t __size, _Tp __c=_Tp())(Global Namespace)']]], - ['resize_2ehpp_421',['resize.hpp',['https://docs.opencv.org/4.2.0/dc/d12/resize_8hpp.html',1,'']]], - ['resize_5f_422',['resize_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7ec59e3064d1cc11501c386d7541abe',1,'cv::cudev::resize_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7ec59e3064d1cc11501c386d7541abe',1,'resize_()(Global Namespace)']]], - ['resize_5ferror_423',['resize_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11139.html',1,'__gnu_pbds']]], - ['resize_5fpolicy_424',['resize_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11611.html',1,'__gnu_pbds::detail']]], - ['resize_5fpolicy_2ehpp_425',['resize_policy.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01202.html',1,'']]], - ['resize_5fpolicy_3c_20_5falloc_3a_3asize_5ftype_20_3e_426',['resize_policy< _Alloc::size_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11611.html',1,'']]], - ['resizedimagedescriptor_427',['ResizedImageDescriptor',['https://docs.opencv.org/4.2.0/d5/d34/classcv_1_1tbm_1_1ResizedImageDescriptor.html',1,'cv::tbm::ResizedImageDescriptor'],['https://docs.opencv.org/4.2.0/d5/d34/classcv_1_1tbm_1_1ResizedImageDescriptor.html#a3da940195bffb9bb396400e140b44844',1,'cv::tbm::ResizedImageDescriptor::ResizedImageDescriptor()']]], - ['resizehashtab_428',['resizeHashTab',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af86523883daef3f618a7ec38fe049edc',1,'cv::SparseMat']]], - ['resizelayer_429',['ResizeLayer',['https://docs.opencv.org/4.2.0/db/d38/classcv_1_1dnn_1_1ResizeLayer.html',1,'cv::dnn']]], - ['resizelike_430',['resizeLike',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'Eigen::PlainObjectBase::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()']]], - ['resizep_431',['resizeP',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga3e57b0f6b2c54564502ff87231c24782',1,'cv::gapi::resizeP()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga3e57b0f6b2c54564502ff87231c24782',1,'resizeP()(Global Namespace)']]], - ['resizeptr_432',['ResizePtr',['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html',1,'cv::cudev']]], - ['resizeptr_433',['resizePtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga344c228aa97d18d8a06ec576b65d652e',1,'cv::cudev::resizePtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga344c228aa97d18d8a06ec576b65d652e',1,'resizePtr()(Global Namespace)']]], - ['resizeptrsz_434',['ResizePtrSz',['https://docs.opencv.org/4.2.0/d3/d8a/structcv_1_1cudev_1_1ResizePtrSz.html',1,'cv::cudev']]], - ['resizewindow_435',['resizeWindow',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga9e80e080f7ef33f897e415358aee7f7e',1,'cv::resizeWindow(const String &winname, int width, int height)'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gab4e70200bf54be967129cf08ac5e18bc',1,'cv::resizeWindow(const String &winname, const cv::Size &size)'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga9e80e080f7ef33f897e415358aee7f7e',1,'resizeWindow(const String &winname, int width, int height)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gab4e70200bf54be967129cf08ac5e18bc',1,'resizeWindow(const String &winname, const cv::Size &size)(Global Namespace)']]], - ['resizing_436',['Resizing',['https://eigen.tuxfamily.org/dox/TopicResizing.html',1,'']]], - ['resolution_437',['resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'DNN used for super resolution'],['https://docs.opencv.org/4.2.0/db/d26/structcv_1_1face_1_1FacemarkAAM_1_1Model_1_1Texture.html#a28fddd3b26132d4a86b29def5002beda',1,'cv::face::FacemarkAAM::Model::Texture::resolution']]], - ['resolution_438',['Resolution',['https://docs.opencv.org/4.2.0/d1/d5b/group__datasets__sr.html',1,'Super Resolution'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html',1,'Super Resolution']]], - ['resolution_20benchmarking_439',['Super-resolution benchmarking',['https://docs.opencv.org/4.2.0/dc/d69/tutorial_dnn_superres_benchmark.html',1,'']]], - ['resolution_20using_20cnns_440',['Super Resolution using CNNs',['https://docs.opencv.org/4.2.0/d8/df8/tutorial_table_of_content_dnn_superres.html',1,'']]], - ['response_441',['response',['https://docs.opencv.org/4.2.0/d9/daa/structcvhalKeyPoint.html#aafc45286e9e117335903c1cb0d6eb5b7',1,'cvhalKeyPoint::response'],['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a6cd22aa3cdcf0613f457d4881b51f7ad',1,'cv::line_descriptor::KeyLine::response'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#a1f163ac418c281042e28895b20514360',1,'cv::KeyPoint::response']]], - ['response_5frow_442',['RESPONSE_ROW',['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#a810ecff1a31927ff24743ba3c4d32cfc',1,'cv::cuda::FastFeatureDetector::RESPONSE_ROW'],['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#a04b6911c96f9416581d449a7413b5d67',1,'cv::cuda::ORB::RESPONSE_ROW']]], - ['restoreimagefromlaplacepyr_443',['restoreImageFromLaplacePyr',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga534299b90685590682e84ca30d40527e',1,'cv::detail::restoreImageFromLaplacePyr()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga534299b90685590682e84ca30d40527e',1,'restoreImageFromLaplacePyr()(Global Namespace)']]], - ['restoreimagefromlaplacepyrgpu_444',['restoreImageFromLaplacePyrGpu',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga30165ec358a75d9476e16138967ed121',1,'cv::detail::restoreImageFromLaplacePyrGpu()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga30165ec358a75d9476e16138967ed121',1,'restoreImageFromLaplacePyrGpu()(Global Namespace)']]], - ['result_445',['result',['https://docs.opencv.org/4.2.0/da/dad/structcv_1_1cudev_1_1Avg.html#ac5e900e72d41f66c6783429f85f7506b',1,'cv::cudev::Avg::result()'],['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1cudev_1_1Max.html#af28b684724fb0f1679dd15218451a2b3',1,'cv::cudev::Max::result()'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1Min.html#afef9e69cc431dc05d1efa412330e0fc2',1,'cv::cudev::Min::result()'],['https://docs.opencv.org/4.2.0/d8/d60/structcv_1_1cudev_1_1Sum.html#a85f798831e6a6e5ed16fc8257bfd42f5',1,'cv::cudev::Sum::result()']]], - ['result_446',['Result',['https://docs.opencv.org/4.2.0/dc/de8/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a699ef8c594d5305ed0dbf74502bb8ae4',1,'cv::GNetworkType< K, std::function< R(Args...)> >::Result'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a3b2e87c13d5240a9f8b5b527554c369f',1,'cv::GNetworkType< K, std::function< std::tuple< R... >(Args...)> >::Result']]], - ['result_5fof_447',['result_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04323.html',1,'std']]], - ['result_5fof_5ft_448',['result_of_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga09f3b216a4c36c4d4070a9acbf7eebbb',1,'std::result_of_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga09f3b216a4c36c4d4070a9acbf7eebbb',1,'result_of_t(Global Namespace)']]], - ['result_5fset_2eh_449',['result_set.h',['https://docs.opencv.org/4.2.0/da/d34/result__set_8h.html',1,'']]], - ['result_5ftype_450',['result_type',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'cv::cudev::binary_function::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< double, double, double >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< float, float, float >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< Predicate::first_argument_type, Predicate::second_argument_type, Predicate::result_type >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< schar, schar, float >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< schar, schar, schar >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< short, short, float >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< short, short, short >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< T1, T2, T1 >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< T1, T2, T2 >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< uchar, uchar, float >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< uchar, uchar, uchar >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< uint, uint, float >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< uint, uint, uint >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< ushort, ushort, float >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< ushort, ushort, ushort >::result_type'],['https://docs.opencv.org/4.2.0/dc/da3/structcv_1_1cudev_1_1BinaryTupleAdapter.html#aa6290c08bc6e285eca71e75849d0cb53',1,'cv::cudev::BinaryTupleAdapter::result_type'],['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a37d6d1a239ec774acc0da25aed8164b5',1,'cv::cudev::NormHamming::result_type'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#a7191f06f76c6295d8a570f64e278246e',1,'cv::cudev::NormL1::result_type'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#a9d8cf8a46bd77b3aee10e3e3bfaa6ded',1,'cv::cudev::NormL1< float >::result_type'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#a40c7ebebf02f696ffd5d3a1cf63d2715',1,'cv::cudev::NormL2::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'cv::cudev::unary_function::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< double, double >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< float, float >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< float, short >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< Op::first_argument_type, Op::result_type >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< Op::second_argument_type, Op::result_type >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< Predicate::argument_type, Predicate::result_type >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< schar, float >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< schar, schar >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< short, float >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< short, short >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< uchar, float >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< uchar, uchar >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< uint, float >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< uint, uint >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< ushort, float >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< ushort, ushort >::result_type'],['https://docs.opencv.org/4.2.0/d4/d57/structcv_1_1cudev_1_1UnaryTupleAdapter.html#ad04e19db079e85417516b8c5aa084cb7',1,'cv::cudev::UnaryTupleAdapter::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_cxx::__detail::_Ffit_finder::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_cxx::binary_compose::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_cxx::project1st::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_cxx::project2nd::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_cxx::select1st::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_cxx::select2nd::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_cxx::subtractive_rng::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_cxx::unary_compose::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_parallel::__binder1st::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_parallel::__binder2nd::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_parallel::__unary_negate::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_EqualFromLess::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_EqualTo::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_Less::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_Lexicographic::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_LexicographicReverse::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_Multiplies::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_Plus::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< __shared_ptr< _Tp, _Lp >, __shared_ptr< _Tp, _Lp >, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< __weak_ptr< _Tp, _Lp >, __weak_ptr< _Tp, _Lp >, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Arg1, _Arg2, _Arg1 >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Arg1, _Arg2, _Arg2 >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Predicate::first_argument_type, _Predicate::second_argument_type, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _T1, _T2, _Res >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _T1, _T2, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Tp *, _Arg, _Ret >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Tp *, _Tp *, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Tp, _Arg, _Ret >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Tp, _Tp, _Tp >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Tp, _Tp, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Tp1, _Tp2, _Result >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< const _Tp *, _Arg, _Ret >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< rope< _CharT, _Alloc >, rope< _CharT, _Alloc >, rope< _CharT, _Alloc > >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< shared_ptr< _Tp >, shared_ptr< _Tp >, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< std::pair< _T1, _T2 >, std::pair< _T1, _T2 >, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< value_type, value_type, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< void, void, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< weak_ptr< _Tp >, weak_ptr< _Tp >, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#aaa49ffe0d995ae8237a5dbad8ac7451c',1,'gamma_distribution< double >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#aaa49ffe0d995ae8237a5dbad8ac7451c',1,'gamma_distribution< result_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#ab1ad02d59f290faf3d8b33e1209cdfae',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae45488abda3f5b20d944da2da5a70001',1,'normal_distribution< double >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae45488abda3f5b20d944da2da5a70001',1,'normal_distribution< result_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::_Maybe_unary_or_binary_function< _Res, _T1 >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::_Maybe_unary_or_binary_function< _Res, _T1, _T2 >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#acc481fbef5fb023da54c1fa303d042ab',1,'std::bernoulli_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::binary_function::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::binary_negate::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::binder1st::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::binder2nd::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#af4383227c82a6c0ee7d105c6b9bad120',1,'std::binomial_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#aa8912582da5d0545839decb4e97304ce',1,'std::cauchy_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#add3353e1e6f35655c681fe7de51ec8c1',1,'std::chi_squared_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::const_mem_fun1_ref_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::const_mem_fun1_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::const_mem_fun_ref_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::const_mem_fun_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#af97ea43c5fbacbc2f8f8296336d946dd',1,'std::discard_block_engine::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a05b12fcc53882e7460348cbd46178e46',1,'std::discrete_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::divides::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::equal_to::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::experimental::fundamentals_v2::owner_less< shared_ptr< _Tp > >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::experimental::fundamentals_v2::owner_less< weak_ptr< _Tp > >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#ac591303d7888e5576784bf67be998683',1,'std::exponential_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#a1af667bbaf9fbf7448cc8b4f6c7ba52d',1,'std::extreme_value_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a81d8f625ee48920d4700c5ff1700aaea',1,'std::fisher_f_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#aaa49ffe0d995ae8237a5dbad8ac7451c',1,'std::gamma_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a3853f646d5644e294b44ccbfc8ec34b1',1,'std::geometric_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::greater::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::greater_equal::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::hash< __gnu_cxx::throw_value_limit >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::hash< __gnu_cxx::throw_value_random >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a8548a254ad408b901f446f84fc1c47b8',1,'std::independent_bits_engine::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::less::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::less_equal::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#ae47aa1543eb8eef0d874551586c0a8df',1,'std::linear_congruential_engine::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::logical_and::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::logical_not::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::logical_or::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#a26f7f5b94e8d179518168c21e7a706bf',1,'std::lognormal_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::mem_fun1_ref_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::mem_fun1_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::mem_fun_ref_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::mem_fun_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#ab1ad02d59f290faf3d8b33e1209cdfae',1,'std::mersenne_twister_engine::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::minus::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::modulus::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::multiplies::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::negate::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#aefbecfa1519e59a3f0937ec9eefe450e',1,'std::negative_binomial_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae45488abda3f5b20d944da2da5a70001',1,'std::normal_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::not_equal_to::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::owner_less< shared_ptr< _Tp > >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::owner_less< void >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::owner_less< weak_ptr< _Tp > >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#abb3387fe0627c23604e72a4b8e43c0f8',1,'std::piecewise_constant_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a3309d6988aede07e6360be89e5dc3f46',1,'std::piecewise_linear_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::plus::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::pointer_to_binary_function::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::pointer_to_unary_function::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a4c3d7ee8432d89d43749cb2c0aa7a588',1,'std::poisson_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06355.html#a26ac3786bd3a188268ded69f800c9dd1',1,'std::random_device::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06515.html#a3079b6a05bc5cce0bfed0a6a59c29590',1,'std::seed_seq::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a7f5d3952ecee856c85fa9bbb6bd608dc',1,'std::shuffle_order_engine::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a63439550169b26a1333639493db44e3b',1,'std::student_t_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#abbbc2513574ed100d700a15bcae13b5a',1,'std::subtract_with_carry_engine::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::unary_function::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::unary_negate::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a6ffc8f43a333c2aa683fe284df6d7be3',1,'std::uniform_int_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#a6cbfd150bdd9f1a1d5e7b54605b4707c',1,'std::uniform_real_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a8d02d8c1098c7944f5efdfed5824bed1',1,'std::weibull_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< __gnu_cxx::throw_value_limit, size_t >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< __gnu_cxx::throw_value_random, size_t >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _FirstArgumentType, _ResultType >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Functor::argument_type, _Functor::result_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Operation2::argument_type, _Operation1::result_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Operation::first_argument_type, _Operation::result_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Operation::second_argument_type, _Operation::result_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Pair, _Pair::first_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Pair, _Pair::second_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Predicate::argument_type, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _SecondArgumentType, _ResultType >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _T1, _Res >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Tp *, _Ret >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Tp, _Ret >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Tp, _Tp >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Tp, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Value, _Value >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< argument_type, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< const _Tp *, _Ret >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< pair< const _Key, _Tp >, pair< const _Key, _Tp > ::first_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< std::pair< _Tp, _Tp >, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< unsigned int, unsigned int >::result_type']]], - ['resultl_451',['ResultL',['https://docs.opencv.org/4.2.0/dc/de8/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#aa8ca41b6f9ff154f122d3f5231b980b9',1,'cv::GNetworkType< K, std::function< R(Args...)> >::ResultL'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a3535631eb028f444e9ded6eb0d68a36f',1,'cv::GNetworkType< K, std::function< std::tuple< R... >(Args...)> >::ResultL']]], - ['resultmask_452',['resultMask',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ac56296a206e88fe886470fe09738c2c8',1,'cv::Stitcher']]], - ['resultroi_453',['resultRoi',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gab7d43257ae6a1d607ee195f369d51b67',1,'cv::detail::resultRoi(const std::vector< Point > &corners, const std::vector< UMat > &images)'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gaeb641b2481aa8261c3ee087a38016485',1,'cv::detail::resultRoi(const std::vector< Point > &corners, const std::vector< Size > &sizes)'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gab7d43257ae6a1d607ee195f369d51b67',1,'resultRoi(const std::vector< Point > &corners, const std::vector< UMat > &images)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gaeb641b2481aa8261c3ee087a38016485',1,'resultRoi(const std::vector< Point > &corners, const std::vector< Size > &sizes)(Global Namespace)']]], - ['resultroiintersection_454',['resultRoiIntersection',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gac27a7690523e62854880225ec2020271',1,'cv::detail::resultRoiIntersection()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gac27a7690523e62854880225ec2020271',1,'resultRoiIntersection()(Global Namespace)']]], - ['resulttl_455',['resultTl',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga0714acd404c7b8024017d6d93a0eab3d',1,'cv::detail::resultTl()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga0714acd404c7b8024017d6d93a0eab3d',1,'resultTl()(Global Namespace)']]], - ['resulttype_456',['ResultType',['https://docs.opencv.org/4.2.0/d3/d59/structcv_1_1Hamming.html#ab8c5ba99d19941d5e2deb35a338da7b4',1,'cv::Hamming::ResultType'],['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1L1.html#a4c4639a0c362606e96b3cf626dbac79b',1,'cv::L1::ResultType'],['https://docs.opencv.org/4.2.0/dc/daa/structcv_1_1L2.html#a1452282c710b7f56201791008678b441',1,'cv::L2::ResultType'],['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html#ae8e69248bd8781896686f78a6542bf18',1,'cv::SL2::ResultType']]], - ['retainbest_457',['retainBest',['https://docs.opencv.org/4.2.0/de/db2/classcv_1_1KeyPointsFilter.html#adeb110acade85bf7a110968c6d856a1c',1,'cv::KeyPointsFilter']]], - ['retainedcornersfraction_458',['retainedCornersFraction',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#a3f5b3afbf29ed8b22d5cab5c0ac7374f',1,'cv::optflow::OpticalFlowPCAFlow']]], - ['rethrow_5fexception_459',['rethrow_exception',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#ga64d0b68338d7edbfd7d95f4177dbc442',1,'std::rethrow_exception()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#ga64d0b68338d7edbfd7d95f4177dbc442',1,'rethrow_exception()(Global Namespace)']]], - ['rethrow_5fif_5fnested_460',['rethrow_if_nested',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#gab61c4f8fae83699092207e16594f6b35',1,'std::rethrow_if_nested()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#gab61c4f8fae83699092207e16594f6b35',1,'rethrow_if_nested()(Global Namespace)']]], - ['retina_461',['Retina',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html',1,'cv::bioinspired']]], - ['retina_20and_20its_20use_20for_20image_20processing_462',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], - ['retina_20and_20real_20world_20vision_463',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], - ['retina_20introduction_464',['Bioinspired Module Retina Introduction',['https://docs.opencv.org/4.2.0/d2/d94/bioinspired_retina.html',1,'']]], - ['retina_2ehpp_465',['retina.hpp',['https://docs.opencv.org/4.2.0/d5/d40/retina_8hpp.html',1,'']]], - ['retina_2emarkdown_466',['retina.markdown',['https://docs.opencv.org/4.2.0/d7/d67/retina_8markdown.html',1,'']]], - ['retina_5fcolor_5fbayer_467',['RETINA_COLOR_BAYER',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html#ggacfb44b3f7c424d78154c5b986b1cac7daaadeb7c2a3a68e14d700f15ed4323b62',1,'cv::bioinspired::RETINA_COLOR_BAYER'],['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html#ggacfb44b3f7c424d78154c5b986b1cac7daaadeb7c2a3a68e14d700f15ed4323b62',1,'RETINA_COLOR_BAYER(Global Namespace)']]], - ['retina_5fcolor_5fdiagonal_468',['RETINA_COLOR_DIAGONAL',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html#ggacfb44b3f7c424d78154c5b986b1cac7dacde9495f290217652b4d82f07f4a18c5',1,'cv::bioinspired::RETINA_COLOR_DIAGONAL'],['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html#ggacfb44b3f7c424d78154c5b986b1cac7dacde9495f290217652b4d82f07f4a18c5',1,'RETINA_COLOR_DIAGONAL(Global Namespace)']]], - ['retina_5fcolor_5frandom_469',['RETINA_COLOR_RANDOM',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html#ggacfb44b3f7c424d78154c5b986b1cac7da3e546a6616bc41d88f973691f6a22388',1,'cv::bioinspired::RETINA_COLOR_RANDOM'],['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html#ggacfb44b3f7c424d78154c5b986b1cac7da3e546a6616bc41d88f973691f6a22388',1,'RETINA_COLOR_RANDOM(Global Namespace)']]], - ['retina_5fillusion_2emarkdown_470',['retina_illusion.markdown',['https://docs.opencv.org/4.2.0/d7/d13/retina__illusion_8markdown.html',1,'']]], - ['retina_5fmodel_2emarkdown_471',['retina_model.markdown',['https://docs.opencv.org/4.2.0/d2/d95/retina__model_8markdown.html',1,'']]], - ['retinafasttonemapping_472',['RetinaFastToneMapping',['https://docs.opencv.org/4.2.0/dd/d73/classcv_1_1bioinspired_1_1RetinaFastToneMapping.html',1,'cv::bioinspired']]], - ['retinafasttonemapping_2ehpp_473',['retinafasttonemapping.hpp',['https://docs.opencv.org/4.2.0/d2/da3/retinafasttonemapping_8hpp.html',1,'']]], - ['retinaparameters_474',['RetinaParameters',['https://docs.opencv.org/4.2.0/d2/df5/structcv_1_1bioinspired_1_1RetinaParameters.html',1,'cv::bioinspired']]], - ['retr_5fccomp_475',['RETR_CCOMP',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71a7d1d4b509fb2a9a8dc2f960357748752',1,'cv::RETR_CCOMP'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71a7d1d4b509fb2a9a8dc2f960357748752',1,'RETR_CCOMP(Global Namespace)']]], - ['retr_5fexternal_476',['RETR_EXTERNAL',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71aa7adc6d6608609fd84650f71b954b981',1,'cv::RETR_EXTERNAL'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71aa7adc6d6608609fd84650f71b954b981',1,'RETR_EXTERNAL(Global Namespace)']]], - ['retr_5ffloodfill_477',['RETR_FLOODFILL',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71acc80715d6a2a51855cb3a9a8093a9352',1,'cv::RETR_FLOODFILL'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71acc80715d6a2a51855cb3a9a8093a9352',1,'RETR_FLOODFILL(Global Namespace)']]], - ['retr_5flist_478',['RETR_LIST',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71a48b9c2cb1056f775ae50bb68288b875e',1,'cv::RETR_LIST'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71a48b9c2cb1056f775ae50bb68288b875e',1,'RETR_LIST(Global Namespace)']]], - ['retr_5ftree_479',['RETR_TREE',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71ab10df56aed56c89a026580adc9431f58',1,'cv::RETR_TREE'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71ab10df56aed56c89a026580adc9431f58',1,'RETR_TREE(Global Namespace)']]], - ['retrievalmodes_480',['RetrievalModes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga819779b9857cc2f8601e6526a3a5bc71',1,'cv::RetrievalModes'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga819779b9857cc2f8601e6526a3a5bc71',1,'RetrievalModes(Global Namespace)']]], - ['retrieve_481',['retrieve',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a9ac7f4b1cdfe624663478568486e6712',1,'cv::VideoCapture']]], - ['return_5ftemporary_5fbuffer_482',['return_temporary_buffer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8033d777ccff23b31daf2feec4dd46ec',1,'std']]], - ['reverse_483',['Reverse',['https://eigen.tuxfamily.org/dox/classEigen_1_1Reverse.html',1,'Eigen']]], - ['reverse_484',['reverse',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7d420a62c310cd992f52c016293f969a',1,'list< __inp, __rebind_inp >::reverse()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a2ab1413dfa1c6858634407a44504a368',1,'std::forward_list::reverse()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7d420a62c310cd992f52c016293f969a',1,'std::list::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a38ea394036d8b096abf322469c80198f',1,'Eigen::DenseBase::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e2f3ac4019184abf95ca0e1a8d82866',1,'Eigen::DenseBase::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a38ea394036d8b096abf322469c80198f',1,'DenseBase< ArrayWrapper< ExpressionType > >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e2f3ac4019184abf95ca0e1a8d82866',1,'DenseBase< ArrayWrapper< ExpressionType > >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a38ea394036d8b096abf322469c80198f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e2f3ac4019184abf95ca0e1a8d82866',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a38ea394036d8b096abf322469c80198f',1,'DenseBase< Solve< Decomposition, RhsType > >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e2f3ac4019184abf95ca0e1a8d82866',1,'DenseBase< Solve< Decomposition, RhsType > >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'Eigen::VectorwiseOp::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'Eigen::VectorwiseOp::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const Derived, Horizontal >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const Derived, Horizontal >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const Derived, Vertical >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const Derived, Vertical >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::reverse() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaeee34a9f7380d22d29f0e895d1c014e0',1,'std::reverse()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaeee34a9f7380d22d29f0e895d1c014e0',1,'reverse(_BidirectionalIterator __first, _BidirectionalIterator __last)(Global Namespace)']]], - ['reverse_3c_20const_20arraywrapper_3c_20expressiontype_20_3e_2c_20bothdirections_20_3e_485',['Reverse< const ArrayWrapper< ExpressionType >, BothDirections >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Reverse.html',1,'']]], - ['reverse_3c_20const_20derived_2c_20bothdirections_20_3e_486',['Reverse< const Derived, BothDirections >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Reverse.html',1,'']]], - ['reverse_3c_20const_20homogeneous_3c_20matrixtype_2c_20_5fdirection_20_3e_2c_20bothdirections_20_3e_487',['Reverse< const Homogeneous< MatrixType, _Direction >, BothDirections >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Reverse.html',1,'']]], - ['reverse_3c_20const_20solve_3c_20decomposition_2c_20rhstype_20_3e_2c_20bothdirections_20_3e_488',['Reverse< const Solve< Decomposition, RhsType >, BothDirections >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Reverse.html',1,'']]], - ['reverse_5fcopy_489',['reverse_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaea264a482d59bc9c99edca7595f025eb',1,'std::reverse_copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaea264a482d59bc9c99edca7595f025eb',1,'reverse_copy()(Global Namespace)']]], - ['reverse_5fiteration_490',['reverse_iteration',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html#ace925c8be06b3640abb7b6f486290dabad65704fae44294b3e727d6704fd61ab6',1,'__gnu_pbds::container_traits']]], - ['reverse_5fiterator_491',['reverse_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html',1,'std::reverse_iterator< _Iterator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab7b54ee87cf04d32f163e87e1bd0b5c5',1,'std::set::reverse_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab7b54ee87cf04d32f163e87e1bd0b5c5',1,'std::set::reverse_iterator'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5b8c0ebedd920b507f4f7ff4e19bf3c6.html#a5b8c0ebedd920b507f4f7ff4e19bf3c6',1,'nlohmann::basic_json::reverse_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a4326966837069ac59f22820fadf8ae3a',1,'std::reverse_iterator::reverse_iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a5c105d8935b69f75c65bdebc9bcef331',1,'std::reverse_iterator::reverse_iterator(iterator_type __x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#abcf630bfb989602beb089b2242b75cad',1,'std::reverse_iterator::reverse_iterator(const reverse_iterator &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#ae754a0cb3c4328241516606ef71440b0',1,'std::reverse_iterator::reverse_iterator(const reverse_iterator< _Iter > &__x)']]], - ['reverseinplace_492',['reverseInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adb8045155ea45f7961fc2a5170e1d921',1,'Eigen::DenseBase::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adb8045155ea45f7961fc2a5170e1d921',1,'DenseBase< ArrayWrapper< ExpressionType > >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adb8045155ea45f7961fc2a5170e1d921',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adb8045155ea45f7961fc2a5170e1d921',1,'DenseBase< Solve< Decomposition, RhsType > >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'Eigen::VectorwiseOp::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const Derived, Horizontal >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const Derived, Vertical >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::reverseInPlace()']]], - ['reversestate_493',['reverseState',['https://docs.opencv.org/4.2.0/dc/db4/structcv_1_1ml_1_1SimulatedAnnealingSolverSystem.html#a9a89d5a7241eb69287a0520ae527192f',1,'cv::ml::SimulatedAnnealingSolverSystem']]], - ['rffeaturegetter_494',['RFFeatureGetter',['https://docs.opencv.org/4.2.0/dc/dca/classcv_1_1ximgproc_1_1RFFeatureGetter.html',1,'cv::ximgproc']]], - ['rfind_495',['rfind',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aed303c4b352ab6457acd8951c36a8b43',1,'__gnu_cxx::__versa_string::rfind(const __versa_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a8f8e404eff65c29c463d5f9ec77b71ea',1,'__gnu_cxx::__versa_string::rfind(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ad21072d1890f3b24181b0781ca1eb1e9',1,'__gnu_cxx::__versa_string::rfind(const _CharT *__s, size_type __pos=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a6a0ee375ebadab1446301069152851e7',1,'__gnu_cxx::__versa_string::rfind(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'__gnu_debug::basic_string::rfind()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< _CharT >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< _CharT >::rfind(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< _CharT >::rfind(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< _CharT >::rfind(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< _CharT, _Traits, _Allocator >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< _CharT, _Traits, _Allocator >::rfind(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< _CharT, _Traits, _Allocator >::rfind(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< _CharT, _Traits, _Allocator >::rfind(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rfind(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rfind(const _Elem *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rfind(_Elem __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< char >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< char >::rfind(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< char >::rfind(const char *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< char >::rfind(char __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rfind(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rfind(const char *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rfind(char __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< char_type, _Traits, _Alloc >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< char_type, _Traits, _Alloc >::rfind(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< char_type, _Traits, _Alloc >::rfind(const char_type *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< char_type, _Traits, _Alloc >::rfind(char_type __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< value_type >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< value_type >::rfind(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< value_type >::rfind(const value_type *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< value_type >::rfind(value_type __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'std::basic_string::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'std::basic_string::rfind(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'std::basic_string::rfind(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'std::basic_string::rfind(_CharT __c, size_type __pos=npos) const noexcept']]], - ['rgb_496',['RGB',['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1838399ee67c0957c0ae42cabfa99033a1c819f641291e88d67ab432f67023a17',1,'cv::ogl::Texture2D']]], - ['rgb_497',['rgb',['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#aa3729704cbd03b83b2e9247b16e28ad1',1,'cv::datasets::GR_skigObj']]], - ['rgb_20depth_20processing_498',['RGB-Depth Processing',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html',1,'']]], - ['rgb2gray_499',['RGB2Gray',['https://docs.opencv.org/4.2.0/d9/d5f/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2Gray.html',1,'cv::cudev::color_cvt_detail::RGB2Gray'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga2adcde9d63378940740c7b54fd00956c',1,'cv::gapi::RGB2Gray(const GMat &src)'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga8238eab93515169d2d66b50ee8a0285b',1,'cv::gapi::RGB2Gray(const GMat &src, float rY, float gY, float bY)'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga2adcde9d63378940740c7b54fd00956c',1,'RGB2Gray(const GMat &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga8238eab93515169d2d66b50ee8a0285b',1,'RGB2Gray(const GMat &src, float rY, float gY, float bY)(Global Namespace)']]], - ['rgb2hls_500',['RGB2HLS',['https://docs.opencv.org/4.2.0/de/d2b/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2HLS.html',1,'cv::cudev::color_cvt_detail']]], - ['rgb2hsv_501',['RGB2HSV',['https://docs.opencv.org/4.2.0/de/d72/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2HSV.html',1,'cv::cudev::color_cvt_detail::RGB2HSV'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#gadaaa97be932cab83d3f35f731bfe0da0',1,'cv::gapi::RGB2HSV()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#gadaaa97be932cab83d3f35f731bfe0da0',1,'RGB2HSV()(Global Namespace)']]], - ['rgb2lab_502',['RGB2Lab',['https://docs.opencv.org/4.2.0/db/df2/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2Lab.html',1,'cv::cudev::color_cvt_detail::RGB2Lab'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga74589c39069c4d068940b521990206cd',1,'cv::gapi::RGB2Lab()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga74589c39069c4d068940b521990206cd',1,'RGB2Lab()(Global Namespace)']]], - ['rgb2luv_503',['RGB2Luv',['https://docs.opencv.org/4.2.0/d0/d2c/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2Luv.html',1,'cv::cudev::color_cvt_detail']]], - ['rgb2rgb_504',['RGB2RGB',['https://docs.opencv.org/4.2.0/de/d9d/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2RGB.html',1,'cv::cudev::color_cvt_detail']]], - ['rgb2xyz_505',['RGB2XYZ',['https://docs.opencv.org/4.2.0/d1/ddf/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2XYZ.html',1,'cv::cudev::color_cvt_detail']]], - ['rgb2ycrcb_506',['RGB2YCrCb',['https://docs.opencv.org/4.2.0/da/d08/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2YCrCb.html',1,'cv::cudev::color_cvt_detail']]], - ['rgb2yuv_507',['RGB2YUV',['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2YUV.html',1,'cv::cudev::color_cvt_detail::RGB2YUV'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga3cc413473e72f242f65a6df44e929d05',1,'cv::gapi::RGB2YUV()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga3cc413473e72f242f65a6df44e929d05',1,'RGB2YUV()(Global Namespace)']]], - ['rgb2yuv422_508',['RGB2YUV422',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga2698756bd4be47c4bda06be15007534f',1,'cv::gapi::RGB2YUV422()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga2698756bd4be47c4bda06be15007534f',1,'RGB2YUV422()(Global Namespace)']]], - ['rgb_5fto_5fbgr555_5ffunc_509',['RGB_to_BGR555_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a5393e1398b7cf941301703b40bfbca',1,'cv::cudev::RGB_to_BGR555_func'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a5393e1398b7cf941301703b40bfbca',1,'RGB_to_BGR555_func(Global Namespace)']]], - ['rgb_5fto_5fbgr565_5ffunc_510',['RGB_to_BGR565_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc256d90bf3fad6fc24e2ed38607d67',1,'cv::cudev::RGB_to_BGR565_func'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc256d90bf3fad6fc24e2ed38607d67',1,'RGB_to_BGR565_func(Global Namespace)']]], - ['rgb_5fto_5fgray_5f_511',['RGB_to_GRAY_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87d203c0c8ff0f0e62a1a3033fef5158',1,'cv::cudev::RGB_to_GRAY_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87d203c0c8ff0f0e62a1a3033fef5158',1,'RGB_to_GRAY_()(Global Namespace)']]], - ['rgb_5fto_5fgray_5ffunc_512',['RGB_to_GRAY_func',['https://docs.opencv.org/4.2.0/d8/ded/structcv_1_1cudev_1_1RGB__to__GRAY__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fhls4_5f_513',['RGB_to_HLS4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b395a8d62d373fd30c62db1b72abb29',1,'cv::cudev::RGB_to_HLS4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b395a8d62d373fd30c62db1b72abb29',1,'RGB_to_HLS4_()(Global Namespace)']]], - ['rgb_5fto_5fhls4_5ffull_5f_514',['RGB_to_HLS4_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2972e34a085b4fa67fb8d9adbdbb1624',1,'cv::cudev::RGB_to_HLS4_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2972e34a085b4fa67fb8d9adbdbb1624',1,'RGB_to_HLS4_FULL_()(Global Namespace)']]], - ['rgb_5fto_5fhls4_5ffull_5ffunc_515',['RGB_to_HLS4_FULL_func',['https://docs.opencv.org/4.2.0/d2/d93/structcv_1_1cudev_1_1RGB__to__HLS4__FULL__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fhls4_5ffull_5ffunc_3c_20float_20_3e_516',['RGB_to_HLS4_FULL_func< float >',['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1cudev_1_1RGB__to__HLS4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgb_5fto_5fhls4_5ffunc_517',['RGB_to_HLS4_func',['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1RGB__to__HLS4__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fhls4_5ffunc_3c_20float_20_3e_518',['RGB_to_HLS4_func< float >',['https://docs.opencv.org/4.2.0/d6/d6b/structcv_1_1cudev_1_1RGB__to__HLS4__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgb_5fto_5fhls_5f_519',['RGB_to_HLS_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8cf674fefaad8de6c8ebac23d683cab',1,'cv::cudev::RGB_to_HLS_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8cf674fefaad8de6c8ebac23d683cab',1,'RGB_to_HLS_()(Global Namespace)']]], - ['rgb_5fto_5fhls_5ffull_5f_520',['RGB_to_HLS_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c3fa990f8e3dcd881f3b2a6c8d21317',1,'cv::cudev::RGB_to_HLS_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c3fa990f8e3dcd881f3b2a6c8d21317',1,'RGB_to_HLS_FULL_()(Global Namespace)']]], - ['rgb_5fto_5fhls_5ffull_5ffunc_521',['RGB_to_HLS_FULL_func',['https://docs.opencv.org/4.2.0/d5/d13/structcv_1_1cudev_1_1RGB__to__HLS__FULL__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fhls_5ffull_5ffunc_3c_20float_20_3e_522',['RGB_to_HLS_FULL_func< float >',['https://docs.opencv.org/4.2.0/d1/d6f/structcv_1_1cudev_1_1RGB__to__HLS__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgb_5fto_5fhls_5ffunc_523',['RGB_to_HLS_func',['https://docs.opencv.org/4.2.0/d8/d24/structcv_1_1cudev_1_1RGB__to__HLS__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fhls_5ffunc_3c_20float_20_3e_524',['RGB_to_HLS_func< float >',['https://docs.opencv.org/4.2.0/d8/d04/structcv_1_1cudev_1_1RGB__to__HLS__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgb_5fto_5fhsv4_5f_525',['RGB_to_HSV4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f886abb121e7479edd9985f745d8378',1,'cv::cudev::RGB_to_HSV4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f886abb121e7479edd9985f745d8378',1,'RGB_to_HSV4_()(Global Namespace)']]], - ['rgb_5fto_5fhsv4_5ffull_5f_526',['RGB_to_HSV4_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f915a6c8432f1d3078f7fe0fd2d2e25',1,'cv::cudev::RGB_to_HSV4_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f915a6c8432f1d3078f7fe0fd2d2e25',1,'RGB_to_HSV4_FULL_()(Global Namespace)']]], - ['rgb_5fto_5fhsv4_5ffull_5ffunc_527',['RGB_to_HSV4_FULL_func',['https://docs.opencv.org/4.2.0/dc/d3a/structcv_1_1cudev_1_1RGB__to__HSV4__FULL__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fhsv4_5ffull_5ffunc_3c_20float_20_3e_528',['RGB_to_HSV4_FULL_func< float >',['https://docs.opencv.org/4.2.0/d5/d76/structcv_1_1cudev_1_1RGB__to__HSV4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgb_5fto_5fhsv4_5ffunc_529',['RGB_to_HSV4_func',['https://docs.opencv.org/4.2.0/d8/db1/structcv_1_1cudev_1_1RGB__to__HSV4__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fhsv4_5ffunc_3c_20float_20_3e_530',['RGB_to_HSV4_func< float >',['https://docs.opencv.org/4.2.0/d9/da5/structcv_1_1cudev_1_1RGB__to__HSV4__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgb_5fto_5fhsv_5f_531',['RGB_to_HSV_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27a648ea7aaa6f0ef6ff7b96de002983',1,'cv::cudev::RGB_to_HSV_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27a648ea7aaa6f0ef6ff7b96de002983',1,'RGB_to_HSV_()(Global Namespace)']]], - ['rgb_5fto_5fhsv_5ffull_5f_532',['RGB_to_HSV_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga735880e475f20e7e447e903d7c1d9a0f',1,'cv::cudev::RGB_to_HSV_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga735880e475f20e7e447e903d7c1d9a0f',1,'RGB_to_HSV_FULL_()(Global Namespace)']]], - ['rgb_5fto_5fhsv_5ffull_5ffunc_533',['RGB_to_HSV_FULL_func',['https://docs.opencv.org/4.2.0/da/dee/structcv_1_1cudev_1_1RGB__to__HSV__FULL__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fhsv_5ffull_5ffunc_3c_20float_20_3e_534',['RGB_to_HSV_FULL_func< float >',['https://docs.opencv.org/4.2.0/d0/d0e/structcv_1_1cudev_1_1RGB__to__HSV__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgb_5fto_5fhsv_5ffunc_535',['RGB_to_HSV_func',['https://docs.opencv.org/4.2.0/db/d4e/structcv_1_1cudev_1_1RGB__to__HSV__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fhsv_5ffunc_3c_20float_20_3e_536',['RGB_to_HSV_func< float >',['https://docs.opencv.org/4.2.0/db/d37/structcv_1_1cudev_1_1RGB__to__HSV__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgb_5fto_5flab4_5f_537',['RGB_to_Lab4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f45e190d32d9fc2a04cf38f8a6bec70',1,'cv::cudev::RGB_to_Lab4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f45e190d32d9fc2a04cf38f8a6bec70',1,'RGB_to_Lab4_()(Global Namespace)']]], - ['rgb_5fto_5flab4_5ffunc_538',['RGB_to_Lab4_func',['https://docs.opencv.org/4.2.0/d2/d21/structcv_1_1cudev_1_1RGB__to__Lab4__func.html',1,'cv::cudev']]], - ['rgb_5fto_5flab_5f_539',['RGB_to_Lab_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55502845125057811645ab720c32ecda',1,'cv::cudev::RGB_to_Lab_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55502845125057811645ab720c32ecda',1,'RGB_to_Lab_()(Global Namespace)']]], - ['rgb_5fto_5flab_5ffunc_540',['RGB_to_Lab_func',['https://docs.opencv.org/4.2.0/db/d41/structcv_1_1cudev_1_1RGB__to__Lab__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fluv4_5f_541',['RGB_to_Luv4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5927bb445f079d37182bac30870a647a',1,'cv::cudev::RGB_to_Luv4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5927bb445f079d37182bac30870a647a',1,'RGB_to_Luv4_()(Global Namespace)']]], - ['rgb_5fto_5fluv4_5ffunc_542',['RGB_to_Luv4_func',['https://docs.opencv.org/4.2.0/d5/d72/structcv_1_1cudev_1_1RGB__to__Luv4__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fluv_5f_543',['RGB_to_Luv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac216ad7dfa7d912f22a8762e7942d3a2',1,'cv::cudev::RGB_to_Luv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac216ad7dfa7d912f22a8762e7942d3a2',1,'RGB_to_Luv_()(Global Namespace)']]], - ['rgb_5fto_5fluv_5ffunc_544',['RGB_to_Luv_func',['https://docs.opencv.org/4.2.0/dc/db6/structcv_1_1cudev_1_1RGB__to__Luv__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fxyz4_5f_545',['RGB_to_XYZ4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0bc96569fd9f992a332950dbd1ab1e1',1,'cv::cudev::RGB_to_XYZ4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0bc96569fd9f992a332950dbd1ab1e1',1,'RGB_to_XYZ4_()(Global Namespace)']]], - ['rgb_5fto_5fxyz4_5ffunc_546',['RGB_to_XYZ4_func',['https://docs.opencv.org/4.2.0/d2/dd8/structcv_1_1cudev_1_1RGB__to__XYZ4__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fxyz_5f_547',['RGB_to_XYZ_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga085a1a3d18623a0ea98a09649d66c533',1,'cv::cudev::RGB_to_XYZ_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga085a1a3d18623a0ea98a09649d66c533',1,'RGB_to_XYZ_()(Global Namespace)']]], - ['rgb_5fto_5fxyz_5ffunc_548',['RGB_to_XYZ_func',['https://docs.opencv.org/4.2.0/dd/d54/structcv_1_1cudev_1_1RGB__to__XYZ__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fycrcb4_5f_549',['RGB_to_YCrCb4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga705c0bb1b78c9d6057296c0bad69e55f',1,'cv::cudev::RGB_to_YCrCb4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga705c0bb1b78c9d6057296c0bad69e55f',1,'RGB_to_YCrCb4_()(Global Namespace)']]], - ['rgb_5fto_5fycrcb4_5ffunc_550',['RGB_to_YCrCb4_func',['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1RGB__to__YCrCb4__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fycrcb_5f_551',['RGB_to_YCrCb_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga231e7f88bc237465187829fa0543e4ca',1,'cv::cudev::RGB_to_YCrCb_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga231e7f88bc237465187829fa0543e4ca',1,'RGB_to_YCrCb_()(Global Namespace)']]], - ['rgb_5fto_5fycrcb_5ffunc_552',['RGB_to_YCrCb_func',['https://docs.opencv.org/4.2.0/df/d9a/structcv_1_1cudev_1_1RGB__to__YCrCb__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fyuv4_5f_553',['RGB_to_YUV4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad07ba1c7b1cc12da97a4ef5f9bc634b',1,'cv::cudev::RGB_to_YUV4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad07ba1c7b1cc12da97a4ef5f9bc634b',1,'RGB_to_YUV4_()(Global Namespace)']]], - ['rgb_5fto_5fyuv4_5ffunc_554',['RGB_to_YUV4_func',['https://docs.opencv.org/4.2.0/d9/d7a/structcv_1_1cudev_1_1RGB__to__YUV4__func.html',1,'cv::cudev']]], - ['rgb_5fto_5fyuv_5f_555',['RGB_to_YUV_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadeac24fe8b664a71ea4b6c9199d40489',1,'cv::cudev::RGB_to_YUV_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadeac24fe8b664a71ea4b6c9199d40489',1,'RGB_to_YUV_()(Global Namespace)']]], - ['rgb_5fto_5fyuv_5ffunc_556',['RGB_to_YUV_func',['https://docs.opencv.org/4.2.0/d7/d9f/structcv_1_1cudev_1_1RGB__to__YUV__func.html',1,'cv::cudev']]], - ['rgba_557',['RGBA',['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1838399ee67c0957c0ae42cabfa99033ab30fb919ec618eaa81c28235e568ef20',1,'cv::ogl::Texture2D']]], - ['rgba_5fto_5fbgr555_5ffunc_558',['RGBA_to_BGR555_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga661584be6f9c3dbc5f0b2c86aa7bcdf2',1,'cv::cudev::RGBA_to_BGR555_func'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga661584be6f9c3dbc5f0b2c86aa7bcdf2',1,'RGBA_to_BGR555_func(Global Namespace)']]], - ['rgba_5fto_5fbgr565_5ffunc_559',['RGBA_to_BGR565_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga233a77c6b6d87ea63a5fb1b91b24baaa',1,'cv::cudev::RGBA_to_BGR565_func'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga233a77c6b6d87ea63a5fb1b91b24baaa',1,'RGBA_to_BGR565_func(Global Namespace)']]], - ['rgba_5fto_5fgray_5f_560',['RGBA_to_GRAY_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40e3d4fb3ee5a4b0ec58d4d650019050',1,'cv::cudev::RGBA_to_GRAY_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40e3d4fb3ee5a4b0ec58d4d650019050',1,'RGBA_to_GRAY_()(Global Namespace)']]], - ['rgba_5fto_5fgray_5ffunc_561',['RGBA_to_GRAY_func',['https://docs.opencv.org/4.2.0/db/d04/structcv_1_1cudev_1_1RGBA__to__GRAY__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fhls4_5f_562',['RGBA_to_HLS4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4207dbe8fca2bcdf1d083de15fb728bf',1,'cv::cudev::RGBA_to_HLS4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4207dbe8fca2bcdf1d083de15fb728bf',1,'RGBA_to_HLS4_()(Global Namespace)']]], - ['rgba_5fto_5fhls4_5ffull_5f_563',['RGBA_to_HLS4_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga543283383d42fa97657b538b6d1560f6',1,'cv::cudev::RGBA_to_HLS4_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga543283383d42fa97657b538b6d1560f6',1,'RGBA_to_HLS4_FULL_()(Global Namespace)']]], - ['rgba_5fto_5fhls4_5ffull_5ffunc_564',['RGBA_to_HLS4_FULL_func',['https://docs.opencv.org/4.2.0/d0/d56/structcv_1_1cudev_1_1RGBA__to__HLS4__FULL__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fhls4_5ffull_5ffunc_3c_20float_20_3e_565',['RGBA_to_HLS4_FULL_func< float >',['https://docs.opencv.org/4.2.0/de/d5e/structcv_1_1cudev_1_1RGBA__to__HLS4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgba_5fto_5fhls4_5ffunc_566',['RGBA_to_HLS4_func',['https://docs.opencv.org/4.2.0/d6/d31/structcv_1_1cudev_1_1RGBA__to__HLS4__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fhls4_5ffunc_3c_20float_20_3e_567',['RGBA_to_HLS4_func< float >',['https://docs.opencv.org/4.2.0/d8/dcb/structcv_1_1cudev_1_1RGBA__to__HLS4__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgba_5fto_5fhls_5f_568',['RGBA_to_HLS_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97deb97a66a2a26235e20e2102d9062d',1,'cv::cudev::RGBA_to_HLS_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97deb97a66a2a26235e20e2102d9062d',1,'RGBA_to_HLS_()(Global Namespace)']]], - ['rgba_5fto_5fhls_5ffull_5f_569',['RGBA_to_HLS_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e7129eadbdf0c96ee1aac3a9f9d3cf',1,'cv::cudev::RGBA_to_HLS_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e7129eadbdf0c96ee1aac3a9f9d3cf',1,'RGBA_to_HLS_FULL_()(Global Namespace)']]], - ['rgba_5fto_5fhls_5ffull_5ffunc_570',['RGBA_to_HLS_FULL_func',['https://docs.opencv.org/4.2.0/dd/db8/structcv_1_1cudev_1_1RGBA__to__HLS__FULL__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fhls_5ffull_5ffunc_3c_20float_20_3e_571',['RGBA_to_HLS_FULL_func< float >',['https://docs.opencv.org/4.2.0/d4/dd3/structcv_1_1cudev_1_1RGBA__to__HLS__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgba_5fto_5fhls_5ffunc_572',['RGBA_to_HLS_func',['https://docs.opencv.org/4.2.0/d9/dd5/structcv_1_1cudev_1_1RGBA__to__HLS__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fhls_5ffunc_3c_20float_20_3e_573',['RGBA_to_HLS_func< float >',['https://docs.opencv.org/4.2.0/d2/d0c/structcv_1_1cudev_1_1RGBA__to__HLS__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgba_5fto_5fhsv4_5f_574',['RGBA_to_HSV4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaccae16993ef4508827079224492619b7',1,'cv::cudev::RGBA_to_HSV4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaccae16993ef4508827079224492619b7',1,'RGBA_to_HSV4_()(Global Namespace)']]], - ['rgba_5fto_5fhsv4_5ffull_5f_575',['RGBA_to_HSV4_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37987f12b0a216f62856539b6f653fc0',1,'cv::cudev::RGBA_to_HSV4_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37987f12b0a216f62856539b6f653fc0',1,'RGBA_to_HSV4_FULL_()(Global Namespace)']]], - ['rgba_5fto_5fhsv4_5ffull_5ffunc_576',['RGBA_to_HSV4_FULL_func',['https://docs.opencv.org/4.2.0/dd/d19/structcv_1_1cudev_1_1RGBA__to__HSV4__FULL__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fhsv4_5ffull_5ffunc_3c_20float_20_3e_577',['RGBA_to_HSV4_FULL_func< float >',['https://docs.opencv.org/4.2.0/d1/d1f/structcv_1_1cudev_1_1RGBA__to__HSV4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgba_5fto_5fhsv4_5ffunc_578',['RGBA_to_HSV4_func',['https://docs.opencv.org/4.2.0/d7/d25/structcv_1_1cudev_1_1RGBA__to__HSV4__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fhsv4_5ffunc_3c_20float_20_3e_579',['RGBA_to_HSV4_func< float >',['https://docs.opencv.org/4.2.0/db/d05/structcv_1_1cudev_1_1RGBA__to__HSV4__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgba_5fto_5fhsv_5f_580',['RGBA_to_HSV_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1cfad19c6894d684050e951db36c9e',1,'cv::cudev::RGBA_to_HSV_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1cfad19c6894d684050e951db36c9e',1,'RGBA_to_HSV_()(Global Namespace)']]], - ['rgba_5fto_5fhsv_5ffull_5f_581',['RGBA_to_HSV_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1c1b90f4c96842fac605e00c795e5d4',1,'cv::cudev::RGBA_to_HSV_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1c1b90f4c96842fac605e00c795e5d4',1,'RGBA_to_HSV_FULL_()(Global Namespace)']]], - ['rgba_5fto_5fhsv_5ffull_5ffunc_582',['RGBA_to_HSV_FULL_func',['https://docs.opencv.org/4.2.0/db/d47/structcv_1_1cudev_1_1RGBA__to__HSV__FULL__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fhsv_5ffull_5ffunc_3c_20float_20_3e_583',['RGBA_to_HSV_FULL_func< float >',['https://docs.opencv.org/4.2.0/d0/d1c/structcv_1_1cudev_1_1RGBA__to__HSV__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgba_5fto_5fhsv_5ffunc_584',['RGBA_to_HSV_func',['https://docs.opencv.org/4.2.0/d1/d7d/structcv_1_1cudev_1_1RGBA__to__HSV__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fhsv_5ffunc_3c_20float_20_3e_585',['RGBA_to_HSV_func< float >',['https://docs.opencv.org/4.2.0/d0/d9b/structcv_1_1cudev_1_1RGBA__to__HSV__func_3_01float_01_4.html',1,'cv::cudev']]], - ['rgba_5fto_5flab4_5f_586',['RGBA_to_Lab4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508e8cc4a2caa74fa0400a20114c30b3',1,'cv::cudev::RGBA_to_Lab4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508e8cc4a2caa74fa0400a20114c30b3',1,'RGBA_to_Lab4_()(Global Namespace)']]], - ['rgba_5fto_5flab4_5ffunc_587',['RGBA_to_Lab4_func',['https://docs.opencv.org/4.2.0/df/d38/structcv_1_1cudev_1_1RGBA__to__Lab4__func.html',1,'cv::cudev']]], - ['rgba_5fto_5flab_5f_588',['RGBA_to_Lab_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28edacccc6e7f45042e2b60a57d1f0b0',1,'cv::cudev::RGBA_to_Lab_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28edacccc6e7f45042e2b60a57d1f0b0',1,'RGBA_to_Lab_()(Global Namespace)']]], - ['rgba_5fto_5flab_5ffunc_589',['RGBA_to_Lab_func',['https://docs.opencv.org/4.2.0/d2/d37/structcv_1_1cudev_1_1RGBA__to__Lab__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fluv4_5f_590',['RGBA_to_Luv4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d24bde7e100c726122f252ddafc9d62',1,'cv::cudev::RGBA_to_Luv4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d24bde7e100c726122f252ddafc9d62',1,'RGBA_to_Luv4_()(Global Namespace)']]], - ['rgba_5fto_5fluv4_5ffunc_591',['RGBA_to_Luv4_func',['https://docs.opencv.org/4.2.0/d7/d2e/structcv_1_1cudev_1_1RGBA__to__Luv4__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fluv_5f_592',['RGBA_to_Luv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28b70d3e2a89f2be9bdd21cf1152df99',1,'cv::cudev::RGBA_to_Luv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28b70d3e2a89f2be9bdd21cf1152df99',1,'RGBA_to_Luv_()(Global Namespace)']]], - ['rgba_5fto_5fluv_5ffunc_593',['RGBA_to_Luv_func',['https://docs.opencv.org/4.2.0/de/d88/structcv_1_1cudev_1_1RGBA__to__Luv__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fxyz4_5f_594',['RGBA_to_XYZ4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4df73ad0e8c2a5025c18ff23b67b3a70',1,'cv::cudev::RGBA_to_XYZ4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4df73ad0e8c2a5025c18ff23b67b3a70',1,'RGBA_to_XYZ4_()(Global Namespace)']]], - ['rgba_5fto_5fxyz4_5ffunc_595',['RGBA_to_XYZ4_func',['https://docs.opencv.org/4.2.0/d9/da9/structcv_1_1cudev_1_1RGBA__to__XYZ4__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fxyz_5f_596',['RGBA_to_XYZ_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9465ec862e67ccfd62bd0aa527144f56',1,'cv::cudev::RGBA_to_XYZ_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9465ec862e67ccfd62bd0aa527144f56',1,'RGBA_to_XYZ_()(Global Namespace)']]], - ['rgba_5fto_5fxyz_5ffunc_597',['RGBA_to_XYZ_func',['https://docs.opencv.org/4.2.0/d7/d53/structcv_1_1cudev_1_1RGBA__to__XYZ__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fycrcb4_5f_598',['RGBA_to_YCrCb4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0d83e83ac0313320dca81f1f34746b',1,'cv::cudev::RGBA_to_YCrCb4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0d83e83ac0313320dca81f1f34746b',1,'RGBA_to_YCrCb4_()(Global Namespace)']]], - ['rgba_5fto_5fycrcb4_5ffunc_599',['RGBA_to_YCrCb4_func',['https://docs.opencv.org/4.2.0/d0/dd4/structcv_1_1cudev_1_1RGBA__to__YCrCb4__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fycrcb_5f_600',['RGBA_to_YCrCb_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga045dae1a17dc3641471d09f7b764c5a6',1,'cv::cudev::RGBA_to_YCrCb_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga045dae1a17dc3641471d09f7b764c5a6',1,'RGBA_to_YCrCb_()(Global Namespace)']]], - ['rgba_5fto_5fycrcb_5ffunc_601',['RGBA_to_YCrCb_func',['https://docs.opencv.org/4.2.0/d1/dd1/structcv_1_1cudev_1_1RGBA__to__YCrCb__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fyuv4_5f_602',['RGBA_to_YUV4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0b611f92998604955be079b722c3ace',1,'cv::cudev::RGBA_to_YUV4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0b611f92998604955be079b722c3ace',1,'RGBA_to_YUV4_()(Global Namespace)']]], - ['rgba_5fto_5fyuv4_5ffunc_603',['RGBA_to_YUV4_func',['https://docs.opencv.org/4.2.0/d3/da0/structcv_1_1cudev_1_1RGBA__to__YUV4__func.html',1,'cv::cudev']]], - ['rgba_5fto_5fyuv_5f_604',['RGBA_to_YUV_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad49ec0b70489d8e271a5d0faf99bfd32',1,'cv::cudev::RGBA_to_YUV_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad49ec0b70489d8e271a5d0faf99bfd32',1,'RGBA_to_YUV_()(Global Namespace)']]], - ['rgba_5fto_5fyuv_5ffunc_605',['RGBA_to_YUV_func',['https://docs.opencv.org/4.2.0/db/d21/structcv_1_1cudev_1_1RGBA__to__YUV__func.html',1,'cv::cudev']]], - ['rgbd_2ehpp_606',['rgbd.hpp',['https://docs.opencv.org/4.2.0/dd/dd3/rgbd_8hpp.html',1,'']]], - ['rgbd_5fnormals_5fimpl_5f_607',['rgbd_normals_impl_',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a039c4c8dac9bdff17ddfaec856dae005',1,'cv::rgbd::RgbdNormals']]], - ['rgbd_5fnormals_5fmethod_608',['RGBD_NORMALS_METHOD',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a47b8e2bd020dac1811e6af967ab882d9',1,'cv::rgbd::RgbdNormals']]], - ['rgbd_5fnormals_5fmethod_5ffals_609',['RGBD_NORMALS_METHOD_FALS',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a47b8e2bd020dac1811e6af967ab882d9ac1f9aed92b2aade8fef82b1ed4d8af17',1,'cv::rgbd::RgbdNormals']]], - ['rgbd_5fnormals_5fmethod_5flinemod_610',['RGBD_NORMALS_METHOD_LINEMOD',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a47b8e2bd020dac1811e6af967ab882d9ae104fe72bdbb1c29b7819e00487f96e0',1,'cv::rgbd::RgbdNormals']]], - ['rgbd_5fnormals_5fmethod_5fsri_611',['RGBD_NORMALS_METHOD_SRI',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a47b8e2bd020dac1811e6af967ab882d9ae7aae37d5b4674c095bf0983e7af4c83',1,'cv::rgbd::RgbdNormals']]], - ['rgbd_5fplane_5fmethod_612',['RGBD_PLANE_METHOD',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#ab6521f3b1414cca7e1763878d7f508bc',1,'cv::rgbd::RgbdPlane']]], - ['rgbd_5fplane_5fmethod_5fdefault_613',['RGBD_PLANE_METHOD_DEFAULT',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#ab6521f3b1414cca7e1763878d7f508bca3ba35c16d774ce9c38011434e7423abb',1,'cv::rgbd::RgbdPlane']]], - ['rgbdframe_614',['RgbdFrame',['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html',1,'cv::rgbd::RgbdFrame'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#add12dd566eb4cb26f28467dddfc39535',1,'cv::rgbd::RgbdFrame::RgbdFrame()'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#a0cec5bf0daac0f332acc42ee508b9068',1,'cv::rgbd::RgbdFrame::RgbdFrame(const Mat &image, const Mat &depth, const Mat &mask=Mat(), const Mat &normals=Mat(), int ID=-1)']]], - ['rgbdicpodometry_615',['RgbdICPOdometry',['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html',1,'cv::rgbd::RgbdICPOdometry'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a857b43034bb6c6d9ee42e24ed66952ba',1,'cv::rgbd::RgbdICPOdometry::RgbdICPOdometry()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a0f13102a7ff27395e1283e26a5353114',1,'cv::rgbd::RgbdICPOdometry::RgbdICPOdometry(const Mat &cameraMatrix, float minDepth=Odometry::DEFAULT_MIN_DEPTH(), float maxDepth=Odometry::DEFAULT_MAX_DEPTH(), float maxDepthDiff=Odometry::DEFAULT_MAX_DEPTH_DIFF(), float maxPointsPart=Odometry::DEFAULT_MAX_POINTS_PART(), const std::vector< int > &iterCounts=std::vector< int >(), const std::vector< float > &minGradientMagnitudes=std::vector< float >(), int transformType=Odometry::RIGID_BODY_MOTION)']]], - ['rgbdnormals_616',['RgbdNormals',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html',1,'cv::rgbd::RgbdNormals'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a3cf169249007645a561e7005ad90b293',1,'cv::rgbd::RgbdNormals::RgbdNormals()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a9f9ebe96fefeb39ebd6cdc6c6370f373',1,'cv::rgbd::RgbdNormals::RgbdNormals(int rows, int cols, int depth, InputArray K, int window_size=5, int method=RgbdNormals::RGBD_NORMALS_METHOD_FALS)']]], - ['rgbdodometry_617',['RgbdOdometry',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html',1,'cv::rgbd::RgbdOdometry'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a6bf4a2db51a92e8cd4e08117c784d661',1,'cv::rgbd::RgbdOdometry::RgbdOdometry()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#ab1e20a2f700e1456b8860096b724ca65',1,'cv::rgbd::RgbdOdometry::RgbdOdometry(const Mat &cameraMatrix, float minDepth=Odometry::DEFAULT_MIN_DEPTH(), float maxDepth=Odometry::DEFAULT_MAX_DEPTH(), float maxDepthDiff=Odometry::DEFAULT_MAX_DEPTH_DIFF(), const std::vector< int > &iterCounts=std::vector< int >(), const std::vector< float > &minGradientMagnitudes=std::vector< float >(), float maxPointsPart=Odometry::DEFAULT_MAX_POINTS_PART(), int transformType=Odometry::RIGID_BODY_MOTION)']]], - ['rgbdplane_618',['RgbdPlane',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html',1,'cv::rgbd::RgbdPlane'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a7afba4984a244910f97cd59b3a486d8f',1,'cv::rgbd::RgbdPlane::RgbdPlane(int method=RgbdPlane::RGBD_PLANE_METHOD_DEFAULT)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a1280b0c59e66bac65cf4dfdeb3109bd3',1,'cv::rgbd::RgbdPlane::RgbdPlane(int method, int block_size, int min_size, double threshold, double sensor_error_a=0, double sensor_error_b=0, double sensor_error_c=0)']]], - ['rho_619',['RHO',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggaaedb1f94e6b143cef163622c531afd88a6bba1f5405e6fcc199a6265d9b146359',1,'cv::RHO'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggaaedb1f94e6b143cef163622c531afd88a6bba1f5405e6fcc199a6265d9b146359',1,'RHO(Global Namespace)']]], - ['rhs_620',['rhs',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#afb31bae949ea257303d8a03dfb696315',1,'cv::optflow::GPCTree::Node::rhs'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseBinaryOp.html#ae508116a8a328c0ca01df38cb4819663',1,'Eigen::CwiseBinaryOp::rhs()']]], - ['ricinterpolator_621',['RICInterpolator',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html',1,'cv::ximgproc']]], - ['ridgedetectionfilter_622',['RidgeDetectionFilter',['https://docs.opencv.org/4.2.0/d4/d36/classcv_1_1ximgproc_1_1RidgeDetectionFilter.html',1,'cv::ximgproc']]], - ['ridgefilter_2ehpp_623',['ridgefilter.hpp',['https://docs.opencv.org/4.2.0/d6/df2/ridgefilter_8hpp.html',1,'']]], - ['riemann_5fzeta_624',['riemann_zeta',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga67a6bfed9b6ab692e8c798b674431424',1,'std::riemann_zeta()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gadfc115751fa7ee0a1c44d9f7028d3a01',1,'std::tr1::riemann_zeta()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga67a6bfed9b6ab692e8c798b674431424',1,'riemann_zeta(_Tp __s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gadfc115751fa7ee0a1c44d9f7028d3a01',1,'riemann_zeta(_Tp __x)(Global Namespace)']]], - ['riemann_5fzetaf_625',['riemann_zetaf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf92063315061a56d3e2c4053156d968e',1,'std::riemann_zetaf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf92063315061a56d3e2c4053156d968e',1,'riemann_zetaf()(Global Namespace)']]], - ['riemann_5fzetal_626',['riemann_zetal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1e92da3b878d75270f38d3ec9b513086',1,'std::riemann_zetal()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1e92da3b878d75270f38d3ec9b513086',1,'riemann_zetal()(Global Namespace)']]], - ['right_627',['right',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#aee7ad615c118d559c9606c5bb98467ac',1,'cv::optflow::GPCTree::Node::right'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#aef80dc1796c5c0a694482af8dc63ae99',1,'cv::ml::DTrees::Node::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_ios< char, _Traits >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_iostream< char >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_istream< char >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_istream< char, _Traits >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_ostream< char >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_ostream< char, _Traits >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_fstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ifstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ios::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_iostream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_istream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_istringstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ofstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ostream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ostringstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_stringstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::ios_base::right'],['../structkinematics_1_1gearpos__t.html#a269b54a5ab18fb7ff52ccf1ff4c6032f',1,'kinematics::gearpos_t::right']]], - ['right_628',['RIGHT',['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a025fb89c3d3b2972d36c728381ebc50e',1,'cv::datasets::RIGHT'],['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a025fb89c3d3b2972d36c728381ebc50e',1,'RIGHT(Global Namespace)']]], - ['right_629',['right',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a1a23b13efe06ee9b3cd9324af25ab538',1,'std']]], - ['rightbutton_630',['RightButton',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#ada240f2528500ad1615e76fb2fd9e2baa3535bdc55ffcd7ad9f7b79e210bbe6a9',1,'cv::viz::MouseEvent']]], - ['righthouseholdersequence_631',['rightHouseholderSequence',['https://eigen.tuxfamily.org/dox/group__Householder__Module.html#ga897ebce658762148f706f73a05525e89',1,'Eigen::rightHouseholderSequence()'],['https://eigen.tuxfamily.org/dox/group__Householder__Module.html#ga897ebce658762148f706f73a05525e89',1,'rightHouseholderSequence()(Global Namespace)']]], - ['rightleft_632',['rightleft',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76abf87d06fd32f99f20821216e5f768287',1,'cv::datasets::rightleft'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76abf87d06fd32f99f20821216e5f768287',1,'rightleft(Global Namespace)']]], - ['rigid_5fbody_5fmotion_633',['RIGID_BODY_MOTION',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a25c82843207af8c3e2a133dc5c887f8da754692ca9d6cadbc925cc7ce2337ed95',1,'cv::rgbd::Odometry']]], - ['ring_5fbuffer_2ehpp_634',['ring_buffer.hpp',['https://docs.opencv.org/4.2.0/d3/dcf/ring__buffer_8hpp.html',1,'']]], - ['rint_635',['rint',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a0211fe61b9e390dfd8ca213fe9c7fca3',1,'Eigen']]], - ['rintd_636',['rintd',['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a4b0f257465a70c776c077cd2b2ca3323',1,'cv::gapi::own']]], - ['rinv_637',['rinv',['https://docs.opencv.org/4.2.0/dc/d2c/structcv_1_1detail_1_1ProjectorBase.html#a4665331ebb0ea7db6d4f48151da35509',1,'cv::detail::ProjectorBase']]], - ['rlofflow_2ehpp_638',['rlofflow.hpp',['https://docs.opencv.org/4.2.0/da/da2/rlofflow_8hpp.html',1,'']]], - ['rlofopticalflowparameter_639',['RLOFOpticalFlowParameter',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html',1,'cv::optflow::RLOFOpticalFlowParameter'],['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a5ba1b4bf0d467f99e0d2a7080ea23f1c',1,'cv::optflow::RLOFOpticalFlowParameter::RLOFOpticalFlowParameter()']]], - ['rng_640',['RNG',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html',1,'cv::RNG'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a06c28035e383bc9eff22e1fad619ddf6',1,'cv::RNG::RNG()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a2d2f54a5a1145e5b9f645b8983c6ae75',1,'cv::RNG::RNG(uint64 state)']]], - ['rng_5fmt19937_641',['RNG_MT19937',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html',1,'cv::RNG_MT19937'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a53ee8b21d1281268d1cf9ae88937d2bb',1,'cv::RNG_MT19937::RNG_MT19937()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a669d829258aed084ce536c508010d1cf',1,'cv::RNG_MT19937::RNG_MT19937(unsigned s)']]], - ['rnnlayer_642',['RNNLayer',['https://docs.opencv.org/4.2.0/dd/dfd/classcv_1_1dnn_1_1RNNLayer.html',1,'cv::dnn']]], - ['ro_5fignore_5fborders_643',['RO_IGNORE_BORDERS',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a341b198401a7ad09481b19cc9dc3908fa2baa80f7a44c2b025b1cbe1f1f313147',1,'cv::ximgproc']]], - ['ro_5fstrict_644',['RO_STRICT',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a341b198401a7ad09481b19cc9dc3908fa24dd34b49f550491aed478468cf383f5',1,'cv::ximgproc']]], - ['robot_645',['robot',['../namespacerobot.html',1,'']]], - ['robot_3a_3atypes_646',['types',['../namespacerobot_1_1types.html',1,'robot']]], - ['robotveltowheelvel_647',['robotVelToWheelVel',['../classkinematics_1_1DiffDriveKinematics.html#ad1b7c74cb5310b0de806301b19835e00',1,'kinematics::DiffDriveKinematics::robotVelToWheelVel()'],['../classkinematics_1_1SwerveDriveKinematics.html#a866a5f46b733c69f60e5aa4226923f39',1,'kinematics::SwerveDriveKinematics::robotVelToWheelVel()']]], - ['robust_20estimation_648',['Robust Estimation',['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html',1,'']]], - ['robust_20features_649',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], - ['robust_20independent_20elementary_20features_650',['BRIEF (Binary Robust Independent Elementary Features)',['https://docs.opencv.org/4.2.0/dc/d7d/tutorial_py_brief.html',1,'']]], - ['robust_2ehpp_651',['robust.hpp',['https://docs.opencv.org/4.2.0/da/d0b/robust_8hpp.html',1,'']]], - ['rodrigues_652',['Rodrigues',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga61585db663d9da06b68e70cfbf6a1eac',1,'cv::Rodrigues()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga61585db663d9da06b68e70cfbf6a1eac',1,'Rodrigues()(Global Namespace)']]], - ['roi_653',['roi',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a4a39d30a977f213f196420244fe1708b',1,'cv::MatOp']]], - ['rois_654',['rois',['https://docs.opencv.org/4.2.0/d9/d17/structcv_1_1GFluidOutputRois.html#a67d0d962745b02488514d64a71acef92',1,'cv::GFluidOutputRois']]], - ['roll_655',['roll',['../structkinematics_1_1jointpos__t.html#adb2c8a622023597110d1c90776af0a07',1,'kinematics::jointpos_t']]], - ['rollingavgfilter_656',['RollingAvgFilter',['../classfilters_1_1RollingAvgFilter.html',1,'filters::RollingAvgFilter< T >'],['../classfilters_1_1RollingAvgFilter.html#a5346e90c747c361c9ab9e0c2d7b7481d',1,'filters::RollingAvgFilter::RollingAvgFilter()']]], - ['rollingguidancefilter_657',['rollingGuidanceFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gacef7fba156b072851dae79e42c39001f',1,'cv::ximgproc::rollingGuidanceFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gacef7fba156b072851dae79e42c39001f',1,'rollingGuidanceFilter()(Global Namespace)']]], - ['root_658',['root',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a504146889949abfe445f87beab4204fd',1,'cv::FileStorage']]], - ['root_20calculation_659',['root calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'Inverse square root calculation'],['https://docs.opencv.org/4.2.0/d5/dc3/group__core__hal__interface__sqrt.html',1,'Square root calculation']]], - ['root_2emarkdown_660',['root.markdown',['https://docs.opencv.org/4.2.0/d9/d1d/root_8markdown.html',1,'']]], - ['rope_661',['rope',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09243.html',1,'__gnu_cxx::rope< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00866.html',1,'(Global Namespace)']]], - ['ropeimpl_2eh_662',['ropeimpl.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01079.html',1,'']]], - ['rose_663',['rose',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a60fd9fa6f7cf66bd232c4b04a797764c',1,'cv::viz::Color']]], - ['rotate_664',['rotate',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a990d571a479b9b336f30c259fb74d18c',1,'cv::Affine3::rotate(const Mat3 &R) const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a771e0532e18299b79c922ddf77f2e362',1,'cv::Affine3::rotate(const Vec3 &rvec) const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a990d571a479b9b336f30c259fb74d18c',1,'Affine3< float >::rotate(const Mat3 &R) const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a771e0532e18299b79c922ddf77f2e362',1,'Affine3< float >::rotate(const Vec3 &rvec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a992087c44abac402a90e48218632d435',1,'Eigen::Transform::rotate()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga4ad01c0978b0ce64baa246811deeac24',1,'cv::rotate()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga55d958eceb0f871e04b1be0adc6ef1b5',1,'cv::cuda::rotate()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga4ad01c0978b0ce64baa246811deeac24',1,'rotate(InputArray src, OutputArray dst, int rotateCode)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga55d958eceb0f871e04b1be0adc6ef1b5',1,'rotate(InputArray src, OutputArray dst, Size dsize, double angle, double xShift=0, double yShift=0, int interpolation=INTER_LINEAR, Stream &stream=Stream::Null())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga52864eec5d415d353701192a9db44f7c',1,'rotate(_ForwardIterator __first, _ForwardIterator __middle, _ForwardIterator __last)(Global Namespace)']]], - ['rotate_5f180_665',['ROTATE_180',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga6f45d55c0b1cc9d97f5353a7c8a7aac2aa65044d24dcdbd15f48fe3887d2e4b16',1,'cv::ROTATE_180'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga6f45d55c0b1cc9d97f5353a7c8a7aac2aa65044d24dcdbd15f48fe3887d2e4b16',1,'ROTATE_180(Global Namespace)']]], - ['rotate_5f90_5fclockwise_666',['ROTATE_90_CLOCKWISE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga6f45d55c0b1cc9d97f5353a7c8a7aac2a0419ea25335f7df5c771a06551a91d2b',1,'cv::ROTATE_90_CLOCKWISE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga6f45d55c0b1cc9d97f5353a7c8a7aac2a0419ea25335f7df5c771a06551a91d2b',1,'ROTATE_90_CLOCKWISE(Global Namespace)']]], - ['rotate_5f90_5fcounterclockwise_667',['ROTATE_90_COUNTERCLOCKWISE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga6f45d55c0b1cc9d97f5353a7c8a7aac2a15ff5052b63aa43a334c865ebd8bb2fd',1,'cv::ROTATE_90_COUNTERCLOCKWISE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga6f45d55c0b1cc9d97f5353a7c8a7aac2a15ff5052b63aa43a334c865ebd8bb2fd',1,'ROTATE_90_COUNTERCLOCKWISE(Global Namespace)']]], - ['rotate_5fcopy_668',['rotate_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaf2a738ab86e393c9c8689708fd9afbf0',1,'std::rotate_copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaf2a738ab86e393c9c8689708fd9afbf0',1,'rotate_copy(_ForwardIterator __first, _ForwardIterator __middle, _ForwardIterator __last, _OutputIterator __result)(Global Namespace)']]], - ['rotated_20boxes_20and_20ellipses_20for_20contours_669',['Creating Bounding rotated boxes and ellipses for contours',['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'']]], - ['rotated_20brief_670',['ORB (Oriented FAST and Rotated BRIEF)',['https://docs.opencv.org/4.2.0/d1/d89/tutorial_py_orb.html',1,'']]], - ['rotatedrect_671',['RotatedRect',['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html',1,'cv::RotatedRect'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#ae1be388780b8d5faf450be18cbbf30f1',1,'cv::RotatedRect::RotatedRect()'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#aba20dfc8444fff72bd820b616f0297ee',1,'cv::RotatedRect::RotatedRect(const Point2f &center, const Size2f &size, float angle)'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a409e2505d117aa7212d40b6ec805b611',1,'cv::RotatedRect::RotatedRect(const Point2f &point1, const Point2f &point2, const Point2f &point3)']]], - ['rotatedrectangleintersection_672',['rotatedRectangleIntersection',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8740e7645628c59d238b0b22c2abe2d4',1,'cv::rotatedRectangleIntersection()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8740e7645628c59d238b0b22c2abe2d4',1,'rotatedRectangleIntersection()(Global Namespace)']]], - ['rotateedge_673',['rotateEdge',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa1179507f651b67c22e06517fbc6a145',1,'cv::Subdiv2D']]], - ['rotateflags_674',['RotateFlags',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6f45d55c0b1cc9d97f5353a7c8a7aac2',1,'cv::RotateFlags'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6f45d55c0b1cc9d97f5353a7c8a7aac2',1,'RotateFlags(Global Namespace)']]], - ['rotatevideo_675',['rotateVideo',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#a506e54c016c4fccb68eed2fe088e3929',1,'CvVideoCamera']]], - ['rotation_676',['rotation',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ae264b90743372dac60643984ebed342e',1,'cv::Affine3::rotation(const Mat3 &R)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#acfe7474211770799f56deb8b81d829f5',1,'cv::Affine3::rotation(const Vec3 &rvec)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a755e92ce3d3af6e8599b2032a2c7ea05',1,'cv::Affine3::rotation(const Mat &data)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a6a6b70508a7d7fd7725696852da7a20c',1,'cv::Affine3::rotation() const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ae264b90743372dac60643984ebed342e',1,'Affine3< float >::rotation(const Mat3 &R)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#acfe7474211770799f56deb8b81d829f5',1,'Affine3< float >::rotation(const Vec3 &rvec)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a755e92ce3d3af6e8599b2032a2c7ea05',1,'Affine3< float >::rotation(const Mat &data)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a6a6b70508a7d7fd7725696852da7a20c',1,'Affine3< float >::rotation() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ad73300a550f878bb7f34485c3d132746',1,'Eigen::Transform::rotation()']]], - ['rotation_677',['ROTATION',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a25c82843207af8c3e2a133dc5c887f8dae3468f480f38fd07af69c3464c87d558',1,'cv::rgbd::Odometry']]], - ['rotation_20estimation_678',['Rotation Estimation',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html',1,'']]], - ['rotation2d_679',['Rotation2D',['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html',1,'Eigen::Rotation2D< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a4628b82c613b7b85010afd45ea0477a2',1,'Eigen::Rotation2D::Rotation2D()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a566207478cb88f9335c912d35913a0cd',1,'Eigen::Rotation2D::Rotation2D(const MatrixBase< Derived > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a3cae6e108a999fa1a4b358b3f467aa35',1,'Eigen::Rotation2D::Rotation2D(const Rotation2D< OtherScalarType > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#afac7b8ec55325568e7c374df672d1eb1',1,'Eigen::Rotation2D::Rotation2D(const Scalar &a)']]], - ['rotation2dd_680',['Rotation2Dd',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gab7af1ccdfb6c865c27fe1fd6bd9e759f',1,'Eigen::Rotation2Dd'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gab7af1ccdfb6c865c27fe1fd6bd9e759f',1,'Rotation2Dd(Global Namespace)']]], - ['rotation2df_681',['Rotation2Df',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga35e2cace3ada497794734edb8bc33b6e',1,'Eigen::Rotation2Df'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga35e2cace3ada497794734edb8bc33b6e',1,'Rotation2Df(Global Namespace)']]], - ['rotation_5fthreshold_682',['rotation_threshold',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a09b1cfb0c4e300bef45d0315e7160685',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['rotationbase_683',['RotationBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'Eigen']]], - ['rotationbase_3c_20angleaxis_3c_20_5fscalar_20_3e_2c_203_20_3e_684',['RotationBase< AngleAxis< _Scalar >, 3 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'']]], - ['rotationbase_3c_20derived_2c_203_20_3e_685',['RotationBase< Derived, 3 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'']]], - ['rotationbase_3c_20map_3c_20const_20quaternion_3c_20_5fscalar_20_3e_2c_20_5foptions_20_3e_2c_203_20_3e_686',['RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'']]], - ['rotationbase_3c_20map_3c_20quaternion_3c_20_5fscalar_20_3e_2c_20_5foptions_20_3e_2c_203_20_3e_687',['RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'']]], - ['rotationbase_3c_20quaternion_3c_20_5fscalar_2c_20_5foptions_20_3e_2c_203_20_3e_688',['RotationBase< Quaternion< _Scalar, _Options >, 3 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'']]], - ['rotationbase_3c_20rotation2d_3c_20_5fscalar_20_3e_2c_202_20_3e_689',['RotationBase< Rotation2D< _Scalar >, 2 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'']]], - ['rotationmatrixtype_690',['RotationMatrixType',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'Eigen::RotationBase::RotationMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'RotationBase< AngleAxis< _Scalar >, 3 >::RotationMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'RotationBase< Derived, 3 >::RotationMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::RotationMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::RotationMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::RotationMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'RotationBase< Rotation2D< _Scalar >, 2 >::RotationMatrixType']]], - ['rotationwarper_691',['RotationWarper',['https://docs.opencv.org/4.2.0/da/db8/classcv_1_1detail_1_1RotationWarper.html',1,'cv::detail']]], - ['rotationwarperbase_692',['RotationWarperBase',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'cv::detail']]], - ['rotationwarperbase_3c_20compressedrectilinearportraitprojector_20_3e_693',['RotationWarperBase< CompressedRectilinearPortraitProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20compressedrectilinearprojector_20_3e_694',['RotationWarperBase< CompressedRectilinearProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20cylindricalportraitprojector_20_3e_695',['RotationWarperBase< CylindricalPortraitProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20cylindricalprojector_20_3e_696',['RotationWarperBase< CylindricalProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20fisheyeprojector_20_3e_697',['RotationWarperBase< FisheyeProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20mercatorprojector_20_3e_698',['RotationWarperBase< MercatorProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20paniniportraitprojector_20_3e_699',['RotationWarperBase< PaniniPortraitProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20paniniprojector_20_3e_700',['RotationWarperBase< PaniniProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20planeportraitprojector_20_3e_701',['RotationWarperBase< PlanePortraitProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20planeprojector_20_3e_702',['RotationWarperBase< PlaneProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20sphericalportraitprojector_20_3e_703',['RotationWarperBase< SphericalPortraitProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20sphericalprojector_20_3e_704',['RotationWarperBase< SphericalProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20stereographicprojector_20_3e_705',['RotationWarperBase< StereographicProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['rotationwarperbase_3c_20transversemercatorprojector_20_3e_706',['RotationWarperBase< TransverseMercatorProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], - ['round_707',['round',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad9eaa98e8016ef17024a18a2f3e5bef3',1,'Eigen']]], - ['round_5ferror_708',['round_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#ae76ce654a6257e29da21c7eba1ad5142',1,'std::numeric_limits']]], - ['round_5fstyle_709',['round_style',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ae94127c8af226c7ebe44e9b39b80813b',1,'std::__numeric_limits_base::round_style'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ae94127c8af226c7ebe44e9b39b80813b',1,'std::numeric_limits::round_style']]], - ['round_5fto_5fnearest_710',['round_to_nearest',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53dbc8572a84ca50272f9e55a1e23e18a43219e58bf0b1438dce779ae47760772',1,'std']]], - ['round_5ftoward_5finfinity_711',['round_toward_infinity',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53dbc8572a84ca50272f9e55a1e23e18a39c9297336599616c46f98eaf73c6191',1,'std']]], - ['round_5ftoward_5fneg_5finfinity_712',['round_toward_neg_infinity',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53dbc8572a84ca50272f9e55a1e23e18a5e57d9d7178fe199cfd05b67e9d3c69d',1,'std']]], - ['round_5ftoward_5fzero_713',['round_toward_zero',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53dbc8572a84ca50272f9e55a1e23e18a16cd490308c5bcba330c09f844f92f1d',1,'std']]], - ['roundd_714',['roundd',['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#af2332e532138858c371946406dffc6c6',1,'cv::gapi::own']]], - ['roundup_715',['roundUp',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga36763beb301d4375d66f7e7f103e0bfa',1,'cv::roundUp(int a, unsigned int b)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gafb8b9cb1c65ed5e4777cd4c53576a95a',1,'cv::roundUp(size_t a, unsigned int b)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga36763beb301d4375d66f7e7f103e0bfa',1,'roundUp(int a, unsigned int b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gafb8b9cb1c65ed5e4777cd4c53576a95a',1,'roundUp(size_t a, unsigned int b)(Global Namespace)']]], - ['routines_716',['Hierarchical Data Format I/O routines',['https://docs.opencv.org/4.2.0/db/d77/group__hdf.html',1,'']]], - ['row_717',['row',['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#aa56a5bdfacc5ccc3c7d0fb124f10f0b5',1,'cv::cudev::GlobPtr::row(int y)'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#ae9157dc9435ac06289f71d23bf9c2077',1,'cv::cudev::GlobPtr::row(int y) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a8d6954870e3c3eacc0ea85cd38bd86b4',1,'cv::cuda::GpuMat::row()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a5a946d10ad0be1e4e733234bc76320d6',1,'cv::cudev::GpuMat_::row()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a4b22e1c23af7a7f2eef8fa478cfa7434',1,'cv::Mat::row()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a957f24ad0e833a3a145499289331277e',1,'cv::Mat_::row()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a957f24ad0e833a3a145499289331277e',1,'Mat_< double >::row()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a957f24ad0e833a3a145499289331277e',1,'Mat_< float >::row()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a957f24ad0e833a3a145499289331277e',1,'Mat_< uchar >::row()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a957f24ad0e833a3a145499289331277e',1,'Mat_< unsigned char >::row()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac3d30cfb0af133632c2f0593767b9690',1,'cv::MatExpr::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'cv::Matx::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< _Tp, cn, 1 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, 1, 3 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, 2, 2 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, 2, 3 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, 3, 3 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, 3, 4 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, 4, 4 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, cn, 1 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< float, 2, 3 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< float, 3, 3 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< float, cn, 1 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< float_type, 4, 4 >::row()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a4f493829ef460456db42c3b802ebf20f',1,'cv::UMat::row()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Triplet.html#ae88b0ad6d31daa53e298b9cc4201fdee',1,'Eigen::Triplet::row()']]], - ['row_5fsample_718',['ROW_SAMPLE',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gga9c57a2b823008dda53d2c7f7059a8710ab8565ac2eb79152a4e3c80b0e9c9fd4c',1,'cv::ml::ROW_SAMPLE'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gga9c57a2b823008dda53d2c7f7059a8710ab8565ac2eb79152a4e3c80b0e9c9fd4c',1,'ROW_SAMPLE(Global Namespace)']]], - ['rowindices_719',['rowIndices',['https://eigen.tuxfamily.org/dox/classEigen_1_1IndexedView.html#af038f6d19de286c0b959f3c1b8daa20d',1,'Eigen::IndexedView']]], - ['rowmajor_720',['RowMajor',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13a77c993a8d9f6efe5c1159fb2ab07dd4f',1,'Eigen::RowMajor'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13a77c993a8d9f6efe5c1159fb2ab07dd4f',1,'RowMajor(Global Namespace)']]], - ['rowmajorbit_721',['RowMajorBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gae4f56c2a60bbe4bd2e44c5b19cbe8762',1,'Eigen::RowMajorBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gae4f56c2a60bbe4bd2e44c5b19cbe8762',1,'RowMajorBit(Global Namespace)']]], - ['rowrange_722',['rowRange',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a0bf9a88fc518cc9986808aaf916f2182',1,'cv::cuda::GpuMat::rowRange(int startrow, int endrow) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#aabccb49164b02284e26884360b7062e8',1,'cv::cuda::GpuMat::rowRange(Range r) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ad6788fae0580dcba9af735cf3d1512b8',1,'cv::cudev::GpuMat_::rowRange(int startrow, int endrow) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a2a99ad74228c204b602c735ca044771a',1,'cv::cudev::GpuMat_::rowRange(Range r) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa6542193430356ad631a9beabc624107',1,'cv::Mat::rowRange(int startrow, int endrow) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a6f5b8257ea38a26295944e9a69caf7e7',1,'cv::Mat::rowRange(const Range &r) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a838edd92ae26c7f1cff59beda1b0518b',1,'cv::UMat::rowRange(int startrow, int endrow) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aced43849cffaea0bf71f35edeba6ea1c',1,'cv::UMat::rowRange(const Range &r) const']]], - ['rows_723',['rows',['https://docs.opencv.org/4.2.0/dc/dd4/structcv_1_1cudev_1_1AffineMapPtrSz.html#ac79b59f7b37b37aaecba89787a532a55',1,'cv::cudev::AffineMapPtrSz::rows'],['https://docs.opencv.org/4.2.0/d1/d0a/structcv_1_1cudev_1_1BinaryTransformPtrSz.html#a606602273798d1c2cb65d87a922d1e8e',1,'cv::cudev::BinaryTransformPtrSz::rows'],['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#af7711e8e03469dd42c7785a575f302fa',1,'cv::cudev::BrdBase::rows'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#a8ce5dde538604cff8ce0657fea5dfd4a',1,'cv::cudev::BrdConstant::rows'],['https://docs.opencv.org/4.2.0/db/d1c/structcv_1_1cudev_1_1CommonAreaInterPtrSz.html#acca3bbd5e7959a9d044eadef200eaf5e',1,'cv::cudev::CommonAreaInterPtrSz::rows'],['https://docs.opencv.org/4.2.0/d2/df7/structcv_1_1cudev_1_1ConstantPtrSz.html#aef3969808520d7d07d099686d76467c7',1,'cv::cudev::ConstantPtrSz::rows'],['https://docs.opencv.org/4.2.0/d2/d00/structcv_1_1cudev_1_1CubicInterPtrSz.html#a520cee3b57634b23735eb26997632151',1,'cv::cudev::CubicInterPtrSz::rows'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1cudev_1_1DerivXPtrSz.html#a7696dd37cb7c5ab5648ce9877a3da815',1,'cv::cudev::DerivXPtrSz::rows'],['https://docs.opencv.org/4.2.0/d2/dfc/structcv_1_1cudev_1_1DerivYPtrSz.html#aad4fc71ad2cd4122ef53f9633f05d525',1,'cv::cudev::DerivYPtrSz::rows'],['https://docs.opencv.org/4.2.0/de/d2e/structcv_1_1cudev_1_1GlobPtrSz.html#acac6694e561997683a142f9ff1f8afac',1,'cv::cudev::GlobPtrSz::rows'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a7385022ca9114e5f5058dbb2f12467cb',1,'cv::cuda::GpuMat::rows'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a454a7773e1423302f35819ea7720303f',1,'cv::cuda::HostMem::rows'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1cudev_1_1IntegerAreaInterPtrSz.html#a8e1c4cedfd149f97e7fb63a2966222ba',1,'cv::cudev::IntegerAreaInterPtrSz::rows'],['https://docs.opencv.org/4.2.0/da/dd9/structcv_1_1cudev_1_1LaplacianPtrSz.html#a654e16a238190bd8285d08c516387ab2',1,'cv::cudev::LaplacianPtrSz::rows'],['https://docs.opencv.org/4.2.0/d9/d2e/structcv_1_1cudev_1_1LinearInterPtrSz.html#ab5df009ffa6c436f7407b5216c114bca',1,'cv::cudev::LinearInterPtrSz::rows'],['https://docs.opencv.org/4.2.0/d5/d22/structcv_1_1cudev_1_1LutPtrSz.html#afa667ace531f787aa91a747c35a9896c',1,'cv::cudev::LutPtrSz::rows'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#abed816466c45234254d25bc59c31245e',1,'cv::Mat::rows'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a89ced746488193fb87bcd1a4794955db',1,'cv::gapi::own::detail::MatHeader::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'cv::Matx::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< _Tp, cn, 1 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, 1, 3 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, 2, 2 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, 2, 3 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, 3, 3 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, 3, 4 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, 4, 4 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, cn, 1 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< float, 2, 3 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< float, 3, 3 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< float, cn, 1 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< float_type, 4, 4 >::rows'],['https://docs.opencv.org/4.2.0/df/dd0/structcv_1_1cudev_1_1NearestInterPtrSz.html#ab24f7a90c9b266502b127b034f873314',1,'cv::cudev::NearestInterPtrSz::rows'],['https://docs.opencv.org/4.2.0/de/d6d/structcv_1_1cudev_1_1PerspectiveMapPtrSz.html#ad1deeeca460905eaae61453ac4ecffa1',1,'cv::cudev::PerspectiveMapPtrSz::rows'],['https://docs.opencv.org/4.2.0/dd/d03/structcv_1_1cudev_1_1RemapPtr1Sz.html#aa891264c9253f93d5c32bfe9c6b34cff',1,'cv::cudev::RemapPtr1Sz::rows'],['https://docs.opencv.org/4.2.0/d4/d59/structcv_1_1cudev_1_1RemapPtr2Sz.html#af7bb64426a52dc5ed1d01962064d7a65',1,'cv::cudev::RemapPtr2Sz::rows'],['https://docs.opencv.org/4.2.0/d3/d8a/structcv_1_1cudev_1_1ResizePtrSz.html#a0d5ac19c9db9534c4c8454dc8b1fc8ae',1,'cv::cudev::ResizePtrSz::rows'],['https://docs.opencv.org/4.2.0/d2/d88/structcv_1_1cudev_1_1ScharrXPtrSz.html#a694c797bcf18ac73ca92f3c58c8da861',1,'cv::cudev::ScharrXPtrSz::rows'],['https://docs.opencv.org/4.2.0/dd/def/structcv_1_1cudev_1_1ScharrYPtrSz.html#a74a0555438ae38dee1d83396bcfbefac',1,'cv::cudev::ScharrYPtrSz::rows'],['https://docs.opencv.org/4.2.0/d0/d19/structcv_1_1cudev_1_1SingleMaskChannelsSz.html#a9ed89076c0770d2dddbca9028cb02cfe',1,'cv::cudev::SingleMaskChannelsSz::rows'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1cudev_1_1SobelXPtrSz.html#a7ab80911e8fd6c3a81d5b5a46bd95c00',1,'cv::cudev::SobelXPtrSz::rows'],['https://docs.opencv.org/4.2.0/dd/dc6/structcv_1_1cudev_1_1SobelYPtrSz.html#ae1c7129f6dbeb1f2567d6dce65d1ee66',1,'cv::cudev::SobelYPtrSz::rows'],['https://docs.opencv.org/4.2.0/d0/dc5/structcv_1_1cudev_1_1Texture.html#aa4863b492d3b31fe97ed847f11b44b6f',1,'cv::cudev::Texture::rows'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a8137e5d25233b57db5616f227f1772ee',1,'cv::UMat::rows'],['https://docs.opencv.org/4.2.0/d0/db7/structcv_1_1cudev_1_1UnaryTransformPtrSz.html#a9fbe6ddd31147857e5e98aeb05886da5',1,'cv::cudev::UnaryTransformPtrSz::rows'],['https://docs.opencv.org/4.2.0/db/d9b/structcv_1_1cudev_1_1ZipPtrSz.html#a9263fcdd10ed30ee752e895d47fc1725',1,'cv::cudev::ZipPtrSz::rows'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a4ee92cc0ce081ee8af90c8c3970b316a',1,'cv::_InputArray::rows()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#aa4545b1d1ae73330ea6c84d42cf8b459',1,'cv::ogl::Buffer::rows()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#ae60d7d5fbccd9a946b741ac8c4a4d00f',1,'cv::ogl::Texture2D::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'Eigen::EigenBase::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< FullPivLU< _MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< HouseholderQR< _MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< Inverse< PermutationType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< LLT< _MatrixType, _UpLo > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< PartialPivLU< _MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< PermutationWrapper< _IndicesType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SVDBase< Derived > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< Transpose< MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< TriangularView< MatrixType, Mode > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ac0bef8081be2c21062c1ae015bd1c1c0',1,'Eigen::HouseholderSequence::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a773e54c9ac272b998430bd27d2889277',1,'Eigen::IncompleteCholesky::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IndexedView.html#ae0d840059e7753d58f3de53da7d04ce0',1,'Eigen::IndexedView::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#abc334ba08270706556366d1cfbb05d95',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acd7ed28ee514287f933de8467768925b',1,'Eigen::PermutationBase::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acd7ed28ee514287f933de8467768925b',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acd7ed28ee514287f933de8467768925b',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acd7ed28ee514287f933de8467768925b',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acd7ed28ee514287f933de8467768925b',1,'PermutationBase< PermutationWrapper< _IndicesType > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a3cdd6cab0abd7ac01925a695fc315d34',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a62e61bb861eee306d5b069ce652b5aa5',1,'Eigen::SparseMatrix::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a62e61bb861eee306d5b069ce652b5aa5',1,'SparseMatrix< Scalar >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a62e61bb861eee306d5b069ce652b5aa5',1,'SparseMatrix< Scalar, ColMajor, int >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a62e61bb861eee306d5b069ce652b5aa5',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a62e61bb861eee306d5b069ce652b5aa5',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a1944e9fa9ce7937bfc3a87b2cb94371f',1,'Eigen::SparseMatrixBase::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a1944e9fa9ce7937bfc3a87b2cb94371f',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a1944e9fa9ce7937bfc3a87b2cb94371f',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a1944e9fa9ce7937bfc3a87b2cb94371f',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a1944e9fa9ce7937bfc3a87b2cb94371f',1,'SparseMatrixBase< Transpose< MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a1944e9fa9ce7937bfc3a87b2cb94371f',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a02e8ec566854085df2b5c6649f43fc88',1,'Eigen::SparseQR::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#aed6e79a5a027d906f3cbf241e533b972',1,'Eigen::SPQR::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a324c2afde060bc028233e0ba81f4f24b',1,'Eigen::TriangularView::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a324c2afde060bc028233e0ba81f4f24b',1,'TriangularView< const Derived, Mode >::rows()']]], - ['rows_5f_724',['rows_',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a84e3ee09ade57fd62920cf477065dde1',1,'cv::rgbd::RgbdNormals']]], - ['rows_5fcount_725',['ROWS_COUNT',['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#af65b7862adcd048ac0db862c3f709ffc',1,'cv::cuda::FastFeatureDetector::ROWS_COUNT'],['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#ae7051c0436bb5f26a691fd992bf3f2f3',1,'cv::cuda::ORB::ROWS_COUNT'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a3b5156553e52661b04bf02fa9628f746a71ea9718fc04d7b7aad87be3ae4832e1',1,'cv::cuda::SURF_CUDA::ROWS_COUNT']]], - ['rowsatcompiletime_726',['RowsAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dadb37c78ebbf15aa20b65c3b70415a1ab',1,'Eigen::DenseBase::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dadb37c78ebbf15aa20b65c3b70415a1ab',1,'DenseBase< ArrayWrapper< ExpressionType > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dadb37c78ebbf15aa20b65c3b70415a1ab',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dadb37c78ebbf15aa20b65c3b70415a1ab',1,'DenseBase< Solve< Decomposition, RhsType > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a456cda7b9d938e57194036a41d634604',1,'Eigen::SparseMatrixBase::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a456cda7b9d938e57194036a41d634604',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a456cda7b9d938e57194036a41d634604',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a456cda7b9d938e57194036a41d634604',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a456cda7b9d938e57194036a41d634604',1,'SparseMatrixBase< Transpose< MatrixType > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a456cda7b9d938e57194036a41d634604',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::RowsAtCompileTime']]], - ['rowspermutation_727',['rowsPermutation',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a1833ed31ad8b60b4ac3dd8dfd435f458',1,'Eigen::SparseLU']]], - ['rowstranspositions_728',['rowsTranspositions',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#abebbfc0ca6e3dd285a0ad0c907abb093',1,'Eigen::FullPivHouseholderQR']]], - ['rowstride_729',['rowStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#a95a043ca237afe8ccb18c6900091b170',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::rowStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#a63bc5874eb4e320e54eb079b43b49d22',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::rowStride()']]], - ['rowvector_730',['RowVector',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga181118570e7a0bb1cf3366180061f14f',1,'Eigen::RowVector'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga181118570e7a0bb1cf3366180061f14f',1,'RowVector(Global Namespace)']]], - ['rowvector2_731',['RowVector2',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gafbd00706e87859d2f0ad68b54e825809',1,'Eigen::RowVector2'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gafbd00706e87859d2f0ad68b54e825809',1,'RowVector2(Global Namespace)']]], - ['rowvector3_732',['RowVector3',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gaaedec7d966e8dafd1611d106333bf461',1,'Eigen::RowVector3'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gaaedec7d966e8dafd1611d106333bf461',1,'RowVector3(Global Namespace)']]], - ['rowvector4_733',['RowVector4',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gafb7f5975c1c3be1237e7f0bf589c6add',1,'Eigen::RowVector4'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gafb7f5975c1c3be1237e7f0bf589c6add',1,'RowVector4(Global Namespace)']]], - ['rowvectorx_734',['RowVectorX',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gacbfe7eb9c070bcb75ef42aec7a6fbafe',1,'Eigen::RowVectorX'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gacbfe7eb9c070bcb75ef42aec7a6fbafe',1,'RowVectorX(Global Namespace)']]], - ['rowwise_735',['rowwise',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2da10891d4d5497f131dba68035811e4',1,'Eigen::DenseBase::rowwise()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2da10891d4d5497f131dba68035811e4',1,'DenseBase< ArrayWrapper< ExpressionType > >::rowwise()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2da10891d4d5497f131dba68035811e4',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::rowwise()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2da10891d4d5497f131dba68035811e4',1,'DenseBase< Solve< Decomposition, RhsType > >::rowwise()']]], - ['rprop_736',['RPROP',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a012b34ee340b5d4d11b6844e12816181aded0d171ce651e6701a3426e192e04c9',1,'cv::ml::ANN_MLP']]], - ['rqdecomp3x3_737',['RQDecomp3x3',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga1aaacb6224ec7b99d34866f8f9baac83',1,'cv::RQDecomp3x3()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga1aaacb6224ec7b99d34866f8f9baac83',1,'RQDecomp3x3()(Global Namespace)']]], - ['rref_738',['rref',['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html#a9075bbb4af21ec947eed45b4e39020a8',1,'cv::detail::VectorRef::rref()'],['https://docs.opencv.org/4.2.0/d2/dab/classcv_1_1detail_1_1VectorRefT.html#a079d259a6734dd2ef250caa2fd5af0a0',1,'cv::detail::VectorRefT::rref()']]], - ['rs_739',['RS',['https://docs.opencv.org/4.2.0/d0/dc4/classcv_1_1GFluidKernel.html#a1f42985cb666b38d9a398787d602b0f4',1,'cv::GFluidKernel']]], - ['rshift_740',['rshift',['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga87af0b66358cc302676f35c1fd56c2ed',1,'cv::cuda::rshift()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga87af0b66358cc302676f35c1fd56c2ed',1,'rshift()(Global Namespace)']]], - ['rsqrt_741',['rsqrt',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a6374a6a9e972e9358d7ab3fced32d7d5',1,'Eigen']]], - ['rtrees_742',['RTrees',['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html',1,'cv::ml']]], - ['rules_743',['Style Rules',['../md_StyleGuide.html#autotoc_md1',1,'']]], - ['rulesoption_744',['RulesOption',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a341b198401a7ad09481b19cc9dc3908f',1,'cv::ximgproc']]], - ['run_745',['run',['https://docs.opencv.org/4.2.0/de/d3a/classcv_1_1text_1_1BaseOCR.html#a5c67898881a8d309eb805811e574f9c5',1,'cv::text::BaseOCR::run(Mat &image, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0)=0'],['https://docs.opencv.org/4.2.0/de/d3a/classcv_1_1text_1_1BaseOCR.html#acffec5372da8bb875e5d04acc8c5410a',1,'cv::text::BaseOCR::run(Mat &image, Mat &mask, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0)=0'],['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html#aae7829f9d9d9d9aa31c7e35c8c7ed501',1,'cv::sfm::BaseSFM::run(InputArrayOfArrays points2d)=0'],['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html#a4ef14d29bb59545938d59e62001acf73',1,'cv::sfm::BaseSFM::run(InputArrayOfArrays points2d, InputOutputArray K, OutputArray Rs, OutputArray Ts, OutputArray points3d)=0'],['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html#ac51a3a5a28945980de39c01d18c80014',1,'cv::sfm::BaseSFM::run(const std::vector< String > &images)=0'],['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html#aa96e83566228a48f46dcd9308e243f97',1,'cv::sfm::BaseSFM::run(const std::vector< String > &images, InputOutputArray K, OutputArray Rs, OutputArray Ts, OutputArray points3d)=0'],['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a1038295b9626937e0d3c34c728f23ab1',1,'cv::DetectionBasedTracker::run()'],['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a6ada71a54726caa84a34787e66b7ea93',1,'cv::text::ERFilter::run()'],['https://docs.opencv.org/4.2.0/d3/dea/classcv_1_1videostab_1_1FastMarchingMethod.html#a49129aadd40ca8c74cf93c7985898dfb',1,'cv::videostab::FastMarchingMethod::run()'],['https://docs.opencv.org/4.2.0/de/d24/classcv_1_1videostab_1_1IDenseOptFlowEstimator.html#a5e961d8501881347a113d3cb75b52aae',1,'cv::videostab::IDenseOptFlowEstimator::run()'],['https://docs.opencv.org/4.2.0/df/de2/classcv_1_1videostab_1_1ISparseOptFlowEstimator.html#aec9ea9902f650a42d7e672a4e331f2fc',1,'cv::videostab::ISparseOptFlowEstimator::run()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a1ce6b92ee1801a96913402483f086e4a',1,'cv::ocl::Kernel::run()'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#aa5697f2be7791040e7fb45d938211a93',1,'cv::dnn::Layer::run()'],['https://docs.opencv.org/4.2.0/d3/d6d/classcv_1_1LMSolver.html#ae32456aafdc15dfef2c757ba744947b8',1,'cv::LMSolver::run()'],['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#a6307a1a7d1806673e7fcb4ab0b0bf5f1',1,'cv::multicalib::MultiCameraCalibration::run()'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#ad029e85a6d22726a475a76c5cb778b05',1,'cv::text::OCRBeamSearchDecoder::run(Mat &image, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a1393d97ac9fab46d5b74369dc21c4370',1,'cv::text::OCRBeamSearchDecoder::run(Mat &image, Mat &mask, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a4efae35246e4df8d28ddd9f51ab0ecfb',1,'cv::text::OCRBeamSearchDecoder::run(InputArray image, int min_confidence, int component_level=0)'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a8107fa523397a2432a0adb7d821ef8a1',1,'cv::text::OCRBeamSearchDecoder::run(InputArray image, InputArray mask, int min_confidence, int component_level=0)'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a80404ecd8a37416ae7987fe0b78583ab',1,'cv::text::OCRHMMDecoder::run(Mat &image, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#af24a91ec82b508f2f09784c32c2a78cf',1,'cv::text::OCRHMMDecoder::run(Mat &image, Mat &mask, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#aee29f2f3895898c8bac19768c2791b77',1,'cv::text::OCRHMMDecoder::run(InputArray image, int min_confidence, int component_level=0)'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a9212b8054453d8c90b4f2f31196f0403',1,'cv::text::OCRHMMDecoder::run(InputArray image, InputArray mask, int min_confidence, int component_level=0)'],['https://docs.opencv.org/4.2.0/d0/d8f/classcv_1_1text_1_1OCRHolisticWordRecognizer.html#a9c97b95245de56e8dff30c1ff8b77206',1,'cv::text::OCRHolisticWordRecognizer::run(Mat &image, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=OCR_LEVEL_WORD) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d0/d8f/classcv_1_1text_1_1OCRHolisticWordRecognizer.html#aa9e1ada2d991725cf3814d546e659b00',1,'cv::text::OCRHolisticWordRecognizer::run(Mat &image, Mat &mask, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=OCR_LEVEL_WORD) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html#af2bb9e7710a5bf616367d8898334001c',1,'cv::text::OCRTesseract::run(Mat &image, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html#a4c1a45ae9390021c99363f0aada3f0ea',1,'cv::text::OCRTesseract::run(Mat &image, Mat &mask, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html#ae53f76683d0267321929e6cda6bb2f03',1,'cv::text::OCRTesseract::run(InputArray image, int min_confidence, int component_level=0)'],['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html#ab2ce0c6ab351e97d7f60a7274c8e9186',1,'cv::text::OCRTesseract::run(InputArray image, InputArray mask, int min_confidence, int component_level=0)'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a929964603a3e5d322245b83ac348cb13',1,'cv::detail::PairwiseSeamFinder::run()'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a9d18358b520c4dd7931a9154cc053649',1,'cv::bioinspired::Retina::run()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#a04cf041a1fbe19d200670b3cda861b83',1,'cv::sfm::SFMLibmvEuclideanReconstruction::run(InputArrayOfArrays points2d) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#aa091d5eb8e36fc8406acd22900a06681',1,'cv::sfm::SFMLibmvEuclideanReconstruction::run(InputArrayOfArrays points2d, InputOutputArray K, OutputArray Rs, OutputArray Ts, OutputArray points3d) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#a9dc08fa4dccd9ed1055c452993a8c1be',1,'cv::sfm::SFMLibmvEuclideanReconstruction::run(const std::vector< String > &images) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#a90ad868b27133f361a6a326c722500e2',1,'cv::sfm::SFMLibmvEuclideanReconstruction::run(const std::vector< String > &images, InputOutputArray K, OutputArray Rs, OutputArray Ts, OutputArray points3d) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d1/d4b/classcv_1_1videostab_1_1SparsePyrLkOptFlowEstimator.html#af36c9713b943b6f5cd97875bcae34b0a',1,'cv::videostab::SparsePyrLkOptFlowEstimator::run()'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#a843674ce05963fc006b0639eb6f2c6d4',1,'cv::bioinspired::TransientAreasSegmentationModule::run()']]], - ['run_20deep_20networks_20in_20browser_746',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], - ['run_20deep_20networks_20on_20android_20device_747',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], - ['run_20length_20encoded_20image_748',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], - ['run_5flength_5fmorphology_2ehpp_749',['run_length_morphology.hpp',['https://docs.opencv.org/4.2.0/d2/d17/run__length__morphology_8hpp.html',1,'']]], - ['runbyimageborder_750',['runByImageBorder',['https://docs.opencv.org/4.2.0/de/db2/classcv_1_1KeyPointsFilter.html#a8feeffd95d167db42575f2dce2337ed6',1,'cv::KeyPointsFilter']]], - ['runbykeypointsize_751',['runByKeypointSize',['https://docs.opencv.org/4.2.0/de/db2/classcv_1_1KeyPointsFilter.html#a0970d203b5cda500d8f77bd92ae0a894',1,'cv::KeyPointsFilter']]], - ['runbypixelsmask_752',['runByPixelsMask',['https://docs.opencv.org/4.2.0/de/db2/classcv_1_1KeyPointsFilter.html#aed11c95cb56f2d0f42d89b37a81baa02',1,'cv::KeyPointsFilter']]], - ['running_753',['running',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#ac14f0dc858286d0879c524988eded738',1,'CvAbstractCamera::running'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#a7e2c1bb4e40bf69706805c7ba53e4ef9',1,'cv::GStreamingCompiled::running()']]], - ['runprepassifnecessary_754',['runPrePassIfNecessary',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a45d12141d2137d94aa862ea4560f6155',1,'cv::videostab::TwoPassStabilizer']]], - ['runprofiling_755',['runProfiling',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a9e3957a938a48d16a665bfc170759461',1,'cv::ocl::Kernel']]], - ['runstateestimator_756',['runStateEstimator',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#ab79490081e952351fd8f46e41974442d',1,'cv::TrackerModel']]], - ['runtask_757',['runTask',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#afdc8795606e2db6d3186d8fb339d4623',1,'cv::ocl::Kernel']]], - ['runtime_5ferror_758',['runtime_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02811.html',1,'std::runtime_error'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02811.html#afce1a363a3b2215518ac16649f8b04c8',1,'std::runtime_error::runtime_error()']]], - ['rvec_759',['rvec',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a2b55e155790f606db5eb913bd350645b',1,'cv::Affine3::rvec()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a2b55e155790f606db5eb913bd350645b',1,'Affine3< float >::rvec()']]], - ['rw_760',['Rw',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#a99638d4d691fbb2b8d2adf7e40f60440',1,'cv::datasets::join']]], - ['rx_761',['Rx',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#aaa084bf27556e6ac0ef23699c6eaf8c9',1,'cv::datasets::join']]], - ['ry_762',['Ry',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#a1cae60b94eaa450e838934b659ff3fa1',1,'cv::datasets::join']]], - ['rz_763',['Rz',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#af33b7142437444f5f4fb83f545bfbbcc',1,'cv::datasets::join']]] + ['raspberry_64',['raspberry',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a114fc719412ae919877cce3c65c03a1b',1,'cv::viz::Color']]], + ['raster_20files_20with_20gdal_65',['Reading Geospatial Raster files with GDAL',['https://docs.opencv.org/4.2.0/d7/d73/tutorial_raster_io_gdal.html',1,'']]], + ['raster_5fio_5fgdal_2emarkdown_66',['raster_io_gdal.markdown',['https://docs.opencv.org/4.2.0/d5/d67/raster__io__gdal_8markdown.html',1,'']]], + ['ratio_67',['ratio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02711.html',1,'std::ratio< _Num, _Den >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00125.html',1,'(Global Namespace)']]], + ['ratio_5fdivide_68',['ratio_divide',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html#gab89b6a439b3582240985f372bc381666',1,'std::ratio_divide'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html#gab89b6a439b3582240985f372bc381666',1,'ratio_divide(Global Namespace)']]], + ['ratio_5fequal_69',['ratio_equal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02723.html',1,'std']]], + ['ratio_5fmultiply_70',['ratio_multiply',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html#gaa0eb766f5844bb5f3ccbeaae9b994257',1,'std::ratio_multiply'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html#gaa0eb766f5844bb5f3ccbeaae9b994257',1,'ratio_multiply(Global Namespace)']]], + ['ratio_5fnot_5fequal_71',['ratio_not_equal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02727.html',1,'std']]], + ['rational_20arithmetic_72',['Rational Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html',1,'']]], + ['raw_20buffers_3a_20the_20map_20class_73',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], + ['raw_5fmoments_74',['raw_moments',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#aeb40fa3150e2408be0f98e3b541948b4',1,'cv::text::ERStat']]], + ['raw_5foutput_75',['RAW_OUTPUT',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af1ea864e1c19796e6264ebb3950c0b9aa639a8ea2b61c2bf03f87cf4c4a5bd824',1,'cv::ml::StatModel']]], + ['raw_5fstorage_5fiterator_76',['raw_storage_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07823.html',1,'std']]], + ['rawin_77',['rawIn',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a4d935052325c9b3a795e5b63090bfe34',1,'cv::_InputArray::rawIn(const std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a57e89a801d76b4fc28b6f0986eb5e88c',1,'cv::_InputArray::rawIn(const std::array< _Tp, _Nm > &arr)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga357a0ae6f9a5951b70fa50ec304d4025',1,'cv::rawIn()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga357a0ae6f9a5951b70fa50ec304d4025',1,'rawIn()(Global Namespace)']]], + ['rawinout_78',['rawInOut',['https://docs.opencv.org/4.2.0/d0/d46/classcv_1_1__InputOutputArray.html#a556d01ad941ab25392981bd72f317813',1,'cv::_InputOutputArray::rawInOut(std::array< _Tp, _Nm > &arr)'],['https://docs.opencv.org/4.2.0/d0/d46/classcv_1_1__InputOutputArray.html#acaf3105a0b692f1167946d50016229c3',1,'cv::_InputOutputArray::rawInOut(std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0a6668770210aac2bab60edef7665338',1,'cv::rawInOut()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0a6668770210aac2bab60edef7665338',1,'rawInOut()(Global Namespace)']]], + ['rawout_79',['rawOut',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a21f3068ffe2bbf6ccdba4c43accec540',1,'cv::_OutputArray::rawOut(std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a10d4780986585b8a3dd6329ffb68af27',1,'cv::_OutputArray::rawOut(std::array< _Tp, _Nm > &arr)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga810a6d3d2b66b6d04e9f07e567b77407',1,'cv::rawOut()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga810a6d3d2b66b6d04e9f07e567b77407',1,'rawOut()(Global Namespace)']]], + ['rawsize_80',['rawSize',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7ddda6e2aa1c1c6c08e89db3d9afe9d0',1,'cv::FileNode']]], + ['rawvideosource_81',['RawVideoSource',['https://docs.opencv.org/4.2.0/d6/d55/classcv_1_1cudacodec_1_1RawVideoSource.html',1,'cv::cudacodec']]], + ['raycast_5fstep_5ffactor_82',['raycast_step_factor',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a240c7c3f984f60b0e11c42c42f8a673e',1,'cv::dynafu::Params::raycast_step_factor'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#afa2ee461b3c112dfe6f536b200957b6e',1,'cv::kinfu::Params::raycast_step_factor']]], + ['rb_5ftree_83',['rb_tree',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09227.html',1,'__gnu_cxx::rb_tree< class, class, class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00863.html',1,'(Global Namespace)']]], + ['rb_5ftree_5f_2ehpp_84',['rb_tree_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01391.html',1,'']]], + ['rb_5ftree_5fmap_85',['rb_tree_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11975.html',1,'__gnu_pbds::detail']]], + ['rb_5ftree_5fmap_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_86',['rb_tree_map_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16706.html',1,'']]], + ['rb_5ftree_5fmap_5f_2fdebug_5ffn_5fimps_2ehpp_87',['rb_tree_map_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16778.html',1,'']]], + ['rb_5ftree_5fmap_5f_2ferase_5ffn_5fimps_2ehpp_88',['rb_tree_map_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16841.html',1,'']]], + ['rb_5ftree_5fmap_5f_2ffind_5ffn_5fimps_2ehpp_89',['rb_tree_map_/find_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16889.html',1,'']]], + ['rb_5ftree_5fmap_5f_2finfo_5ffn_5fimps_2ehpp_90',['rb_tree_map_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16973.html',1,'']]], + ['rb_5ftree_5fmap_5f_2finsert_5ffn_5fimps_2ehpp_91',['rb_tree_map_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17006.html',1,'']]], + ['rb_5ftree_5fmap_5f_2fnode_2ehpp_92',['rb_tree_map_/node.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17102.html',1,'']]], + ['rb_5ftree_5fmap_5f_2fsplit_5fjoin_5ffn_5fimps_2ehpp_93',['rb_tree_map_/split_join_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17249.html',1,'']]], + ['rb_5ftree_5fmap_5f_2ftraits_2ehpp_94',['rb_tree_map_/traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17318.html',1,'']]], + ['rb_5ftree_5fnode_5f_95',['rb_tree_node_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11967.html',1,'__gnu_pbds::detail']]], + ['rb_5ftree_5ftag_96',['rb_tree_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11243.html',1,'__gnu_pbds']]], + ['rbegin_97',['rbegin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#afafcdd90aee602e7dee77c634b27604d',1,'__gnu_cxx::__versa_string::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a68dfba201272143f3b4bffcd6377b110',1,'__gnu_cxx::__versa_string::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< _CharT >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< _CharT >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< _CharT, _Traits, _Allocator >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< _CharT, _Traits, _Allocator >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< char >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< char >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< char_type, _Traits, _Alloc >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< char_type, _Traits, _Alloc >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'basic_string< value_type >::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'basic_string< value_type >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a00b51e916472a01d8d68945681ab8245',1,'deque< _StateSeqT >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#af3714db48a222a584264a3e668bd5b3c',1,'deque< _StateSeqT >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8a4cacefc7a58e913f2e9876df0d59de',1,'list< __inp, __rebind_inp >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3ba0b1fa92ccc5268e64c0023632aee7',1,'list< __inp, __rebind_inp >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'match_results< _Bi_iter >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'match_results< _Bi_iter >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a43226db34f7ad7cb99e1cc9f6549ae03',1,'std::basic_string::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c8fd2b5572dc31cbd455698a398ec9d',1,'std::basic_string::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a00b51e916472a01d8d68945681ab8245',1,'std::deque::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#af3714db48a222a584264a3e668bd5b3c',1,'std::deque::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8a4cacefc7a58e913f2e9876df0d59de',1,'std::list::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3ba0b1fa92ccc5268e64c0023632aee7',1,'std::list::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a4ca3db2d238641b23001310899d884fb',1,'std::map::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a461fb30e5fd8953549843ff651d06ec8',1,'std::map::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'std::match_results::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'std::match_results::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ab44fe0a492344094f870a3f149d2dad1',1,'std::multimap::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a6fec7115cf9a873709d612aede06d551',1,'std::multimap::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a6b0cbc71ad54db5d009609ec077bc13f',1,'std::multiset::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a9c6f4b02f2ed2c82963fce15fb3d24ee',1,'std::set::rbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'std::vector::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'std::vector::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< __diff_type >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< __diff_type >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _CharClassT >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _CharClassT >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _CharT >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _CharT >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _Cmpt >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _Cmpt >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _Node *, _Nodeptr_Alloc >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _Node *, _Nodeptr_Alloc >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _RealType >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _RealType >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _State< _TraitsT::char_type > >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _State< _TraitsT::char_type > >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< _StringT >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< _StringT >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< block_type, allocator_type >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< block_type, allocator_type >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< Catalog_info * >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< Catalog_info * >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< double >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< double >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< int >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< int >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< result_type >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< result_type >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< size_t >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< size_t >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< std::pair< _BiIter, int > >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< std::pair< _BiIter, int > >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< std::pair< _StateIdT, std::vector > >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< std::pair< _StateIdT, std::vector > >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< std::pair< _StrTransT, _StrTransT > >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< std::pair< _StrTransT, _StrTransT > >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< sub_match< _Bi_iter >, _Alloc >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< sub_match< _Bi_iter >, _Alloc >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a20e5ca3edaf43348d346614730c8b637',1,'vector< sub_match< _BiIter >, _Alloc >::rbegin() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ac1f157333783a401dd4a0c23edaddf1c',1,'vector< sub_match< _BiIter >, _Alloc >::rbegin() const noexcept'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'Eigen::VectorwiseOp::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'Eigen::VectorwiseOp::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const Derived, Horizontal >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const Derived, Horizontal >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const Derived, Vertical >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const Derived, Vertical >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::rbegin() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a91a8087eb76e210b07192c81d362dd1e',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::rbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa73e8a0230fcc049346057ef1a6efe02',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::rbegin() const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aff8e38cd973bc94557fa8d36433c0e4c.html#aff8e38cd973bc94557fa8d36433c0e4c',1,'nlohmann::basic_json::rbegin() noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aab1329f44c8301b7679962726a043549.html#aab1329f44c8301b7679962726a043549',1,'nlohmann::basic_json::rbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae16f6e3954ee80febd7a13ca23c0cb69',1,'std::rbegin(_Container &__cont) -> decltype(__cont.rbegin())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a82b4f328583bc1eacb96e1916d2499a4',1,'std::rbegin(const _Container &__cont) -> decltype(__cont.rbegin())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#adc3d2e80cfd605a4d419e5ea94847f03',1,'std::rbegin(_Tp(&__arr)[_Nm])'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa98b19c718d53cb983cff800ffe2fdaf',1,'std::rbegin(initializer_list< _Tp > __il)']]], + ['rbf_98',['RBF',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56a8e1f51ebeabd14cbd622f0f945831d4c',1,'cv::ml::SVM']]], + ['rc_99',['rc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11987.html',1,'__gnu_pbds::detail']]], + ['rc_2ehpp_100',['rc.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01394.html',1,'']]], + ['rc_3c_20typename_20binomial_5fheap_5fbase_3c_20value_5ftype_2c_20cmp_5ffn_2c_20_5falloc_20_3e_3a_3anode_2c_20_5falloc_20_3e_101',['rc< typename binomial_heap_base< Value_Type, Cmp_Fn, _Alloc >::node, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11987.html',1,'']]], + ['rc_5fbinomial_5fheap_102',['rc_binomial_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11991.html',1,'__gnu_pbds::detail']]], + ['rc_5fbinomial_5fheap_5f_2ehpp_103',['rc_binomial_heap_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01397.html',1,'']]], + ['rc_5fbinomial_5fheap_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_104',['rc_binomial_heap_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16709.html',1,'']]], + ['rc_5fbinomial_5fheap_5f_2fdebug_5ffn_5fimps_2ehpp_105',['rc_binomial_heap_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16781.html',1,'']]], + ['rc_5fbinomial_5fheap_5f_2ferase_5ffn_5fimps_2ehpp_106',['rc_binomial_heap_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16844.html',1,'']]], + ['rc_5fbinomial_5fheap_5f_2finsert_5ffn_5fimps_2ehpp_107',['rc_binomial_heap_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17009.html',1,'']]], + ['rc_5fbinomial_5fheap_5f_2fsplit_5fjoin_5ffn_5fimps_2ehpp_108',['rc_binomial_heap_/split_join_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17252.html',1,'']]], + ['rc_5fbinomial_5fheap_5f_2ftrace_5ffn_5fimps_2ehpp_109',['rc_binomial_heap_/trace_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17300.html',1,'']]], + ['rc_5fbinomial_5fheap_5ftag_110',['rc_binomial_heap_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11279.html',1,'__gnu_pbds']]], + ['rc_5fstring_5fbase_2eh_111',['rc_string_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01076.html',1,'']]], + ['rcond_112',['rcond',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a0bc63f910960dc3e35acecc8442025b6',1,'Eigen::FullPivLU::rcond()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#ae646403fdde3a4b18e278a32c61a0953',1,'Eigen::LDLT::rcond()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a59338fa78db171d02fd5a2c9e4f3a30c',1,'Eigen::LLT::rcond()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a472b46d5d9ff7c328e1dccc13805f690',1,'Eigen::PartialPivLU::rcond()']]], + ['rctype_113',['RCType',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a174458d4987ebe57ec7efa2b8670dd09',1,'cv::cudacodec::EncoderParams']]], + ['rdbuf_114',['rdbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'basic_ios< char, _Traits >::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'basic_ios< char, _Traits >::rdbuf(basic_streambuf< char, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'basic_iostream< char >::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'basic_iostream< char >::rdbuf(basic_streambuf< char, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'basic_istream< char >::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'basic_istream< char >::rdbuf(basic_streambuf< char, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'basic_istream< char, _Traits >::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'basic_istream< char, _Traits >::rdbuf(basic_streambuf< char, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'basic_ostream< char >::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'basic_ostream< char >::rdbuf(basic_streambuf< char, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'basic_ostream< char, _Traits >::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'basic_ostream< char, _Traits >::rdbuf(basic_streambuf< char, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_fstream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02079.html#a7e87dac89bf6608d35890a632336b347',1,'std::basic_fstream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_ifstream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02071.html#a7f104c73e5bd5a76405a0edc299da3e2',1,'std::basic_ifstream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'std::basic_ios::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_ios::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'std::basic_iostream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_iostream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'std::basic_istream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_istream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_istringstream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02471.html#a095330a0443ef6ad188ede768152c6c4',1,'std::basic_istringstream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_ofstream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02075.html#ac507f40924f057de2f2c6ced401e6467',1,'std::basic_ofstream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a21f92cbfd296f81694cdaef956d0bd6d',1,'std::basic_ostream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_ostream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_ostringstream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02475.html#af8c4c9652fcb9c4e94d86cd8210ee679',1,'std::basic_ostringstream::rdbuf() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a163ac287eb3cec7bb62ed893be51658b',1,'std::basic_stringstream::rdbuf(basic_streambuf< _CharT, _Traits > *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02479.html#a20c0bfc4dc37364093b8c7bfe77d1d7f',1,'std::basic_stringstream::rdbuf() const']]], + ['rdstate_115',['rdstate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'basic_ios< char, _Traits >::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'basic_iostream< char >::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'basic_istream< char >::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'basic_istream< char, _Traits >::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'basic_ostream< char >::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'basic_ostream< char, _Traits >::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_fstream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_ifstream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_ios::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_iostream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_istream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_istringstream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_ofstream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_ostream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_ostringstream::rdstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5f082a6a02ca25407fa6806bbd84e887',1,'std::basic_stringstream::rdstate()']]], + ['re_116',['re',['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#ac4cd4a983c71a573eaeaa8bbbda02495',1,'cv::Complex']]], + ['read_117',['READ',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482daa0dcc459c4d100c35ccfa9a643827bed',1,'cv::FileStorage']]], + ['read_118',['read',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#aef2ad3f4145bd6e8c3664eb1c4b5e1e6',1,'cv::Algorithm::read(const FileNode &fn)'],['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#ad8c591bacb34c485f5b7a250c314fc53',1,'cv::Algorithm::read(const FileNode &fn)'],['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html#af4ccaaa1001e0c9437b7e969be1cdf7b',1,'cv::face::BasicFaceRecognizer::read()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a9a4c83beabf93afec71cfeb152dffc5a',1,'cv::line_descriptor::BinaryDescriptor::read()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a6e3f096b121259fd3bab1c2437e840c5',1,'cv::CascadeClassifier::read()'],['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a211adc6596382d9848fd379d8a8dedf7',1,'cv::linemod::ColorGradient::read()'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#a0da9168833678341315403044f473404',1,'cv::CvFeatureParams::read()'],['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#a6677fc10517b4d00938f7566af162d3b',1,'cv::CvHaarFeatureParams::read()'],['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html#acca110107f49c38903ead85ab0d9939c',1,'cv::CvParams::read()'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a08ec3f3eecde3c63b677b89bfc12ad69',1,'cv::linemod::DepthNormal::read()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#aba10146926505e6b90377f24489e336c',1,'cv::DescriptorMatcher::read(const String &fileName)'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#abb46ea487ffa0c0f9dd72d3de9fd42ab',1,'cv::DescriptorMatcher::read(const FileNode &) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a6388744994ba8eb20b1d2f105e36e2f1',1,'cv::linemod::Detector::read()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#acc42e5b04595dba71f0777c7179af8c3',1,'cv::face::FaceRecognizer::read(const String &filename)'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#a6ce52a3c8941aaa3cd09c31d6a6ef192',1,'cv::face::FaceRecognizer::read(const FileNode &fn) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d9/db9/structcv_1_1linemod_1_1Feature.html#a8adc04698f0a0f1f4e3b11bfc9b3df92',1,'cv::linemod::Feature::read()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a84382d745ea4b4fee70ed2e665ad1b61',1,'cv::Feature2D::read(const String &fileName)'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a484d5df8a2768a38073c581f056d91d7',1,'cv::Feature2D::read(const FileNode &) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ab24433dde37f770766481a91983e5f44',1,'cv::FileNode::read(const FileNode &node, int &value, int default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a170bdafea987ecb87f36651be1cf8293',1,'cv::FileNode::read(const FileNode &node, float &value, float default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9827a4c7674d30c00dd95099a663c402',1,'cv::FileNode::read(const FileNode &node, double &value, double default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#af37d1783df83ede65e0bff01a2f3f450',1,'cv::FileNode::read(const FileNode &node, std::string &value, const std::string &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a0aaa102983844a5b4a43e12bee7703b3',1,'cv::FileNode::read(const FileNode &node, Mat &mat, const Mat &default_mat=Mat())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa667d34b449dd325150d41ca3cf2294c',1,'cv::FileNode::read(const FileNode &node, SparseMat &mat, const SparseMat &default_mat=SparseMat())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a5159eab4b11bb7e3383c8339c45cd698',1,'cv::FileNode::read(const FileNode &node, KeyPoint &value, const KeyPoint &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9075e2076b2ce3656751d65863c2dc43',1,'cv::FileNode::read(const FileNode &node, DMatch &value, const DMatch &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ac0d9174cb7cdfac05b0daa654d2101d7',1,'cv::FileNode::read(const FileNode &node, Point_< _Tp > &value, const Point_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a543159a22b6e9fb19773696b38ea4189',1,'cv::FileNode::read(const FileNode &node, Point3_< _Tp > &value, const Point3_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a91e5af29534fa39bc1b9ea7d62eb0b66',1,'cv::FileNode::read(const FileNode &node, Size_< _Tp > &value, const Size_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#abf08ccd13398796da79c6fd07cf08d87',1,'cv::FileNode::read(const FileNode &node, Complex< _Tp > &value, const Complex< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae7d745c67c1d944ba3eb1245b6714496',1,'cv::FileNode::read(const FileNode &node, Rect_< _Tp > &value, const Rect_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a399ed562c8178cae18851944d304ed54',1,'cv::FileNode::read(const FileNode &node, Vec< _Tp, cn > &value, const Vec< _Tp, cn > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a6838c55dcea3626add455ce6498fa46e',1,'cv::FileNode::read(const FileNode &node, Matx< _Tp, m, n > &value, const Matx< _Tp, m, n > &default_matx=Matx< _Tp, m, n >())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aada6c34de9b3b1755c217f2ca96051bd',1,'cv::FileNode::read(const FileNode &node, Scalar_< _Tp > &value, const Scalar_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a143b31786d7927e3660ae42fdb258fb2',1,'cv::FileNode::read(const FileNode &node, Range &value, const Range &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae541c479c2833d1cdeea6e80f8faee98',1,'cv::FileNode::read(const FileNode &node, bool &value, bool default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9c9fc5bcbaa3bad151a96e992cdad9a1',1,'cv::FileNode::read(const FileNode &node, uchar &value, uchar default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a8187ea955da47ab2c631c31245320028',1,'cv::FileNode::read(const FileNode &node, schar &value, schar default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a95512c3eba67570b9c1279e6f053972b',1,'cv::FileNode::read(const FileNode &node, ushort &value, ushort default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa9676bab54dc0ad11e3d7142b9a032b3',1,'cv::FileNode::read(const FileNode &node, short &value, short default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#acdd936a4632cc7b4f65836f701e7ccf9',1,'cv::FileNode::read(FileNodeIterator &it, std::vector< _Tp > &vec, size_t maxCount=(size_t) INT_MAX)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7ee12dcc6ea674d1f6a438703d948080',1,'cv::FileNode::read(const FileNode &node, _Tp &value, const _Tp &default_value=static_cast< _Tp >(0))'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a19b13d9369933709af74a8fd3c5e0d15',1,'cv::FileNode::read(const FileNode &node, std::vector< _Tp > &vec, const std::vector< _Tp > &default_value=std::vector< _Tp >())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a75a16693d3fd15f0c6ddab1abd8ce273',1,'cv::FileNode::read(const FileNode &node, std::vector< KeyPoint > &vec, const std::vector< KeyPoint > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a82ddaf6232746691f81f232454d491ae',1,'cv::FileNode::read(const FileNode &node, std::vector< DMatch > &vec, const std::vector< DMatch > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ab24433dde37f770766481a91983e5f44',1,'cv::FileNode::read(const FileNode &node, int &value, int default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a170bdafea987ecb87f36651be1cf8293',1,'cv::FileNode::read(const FileNode &node, float &value, float default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9827a4c7674d30c00dd95099a663c402',1,'cv::FileNode::read(const FileNode &node, double &value, double default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#af37d1783df83ede65e0bff01a2f3f450',1,'cv::FileNode::read(const FileNode &node, std::string &value, const std::string &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a0aaa102983844a5b4a43e12bee7703b3',1,'cv::FileNode::read(const FileNode &node, Mat &mat, const Mat &default_mat=Mat())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa667d34b449dd325150d41ca3cf2294c',1,'cv::FileNode::read(const FileNode &node, SparseMat &mat, const SparseMat &default_mat=SparseMat())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a5159eab4b11bb7e3383c8339c45cd698',1,'cv::FileNode::read(const FileNode &node, KeyPoint &value, const KeyPoint &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9075e2076b2ce3656751d65863c2dc43',1,'cv::FileNode::read(const FileNode &node, DMatch &value, const DMatch &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ac0d9174cb7cdfac05b0daa654d2101d7',1,'cv::FileNode::read(const FileNode &node, Point_< _Tp > &value, const Point_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a543159a22b6e9fb19773696b38ea4189',1,'cv::FileNode::read(const FileNode &node, Point3_< _Tp > &value, const Point3_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a91e5af29534fa39bc1b9ea7d62eb0b66',1,'cv::FileNode::read(const FileNode &node, Size_< _Tp > &value, const Size_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#abf08ccd13398796da79c6fd07cf08d87',1,'cv::FileNode::read(const FileNode &node, Complex< _Tp > &value, const Complex< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae7d745c67c1d944ba3eb1245b6714496',1,'cv::FileNode::read(const FileNode &node, Rect_< _Tp > &value, const Rect_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a399ed562c8178cae18851944d304ed54',1,'cv::FileNode::read(const FileNode &node, Vec< _Tp, cn > &value, const Vec< _Tp, cn > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a6838c55dcea3626add455ce6498fa46e',1,'cv::FileNode::read(const FileNode &node, Matx< _Tp, m, n > &value, const Matx< _Tp, m, n > &default_matx=Matx< _Tp, m, n >())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aada6c34de9b3b1755c217f2ca96051bd',1,'cv::FileNode::read(const FileNode &node, Scalar_< _Tp > &value, const Scalar_< _Tp > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a143b31786d7927e3660ae42fdb258fb2',1,'cv::FileNode::read(const FileNode &node, Range &value, const Range &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae541c479c2833d1cdeea6e80f8faee98',1,'cv::FileNode::read(const FileNode &node, bool &value, bool default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9c9fc5bcbaa3bad151a96e992cdad9a1',1,'cv::FileNode::read(const FileNode &node, uchar &value, uchar default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a8187ea955da47ab2c631c31245320028',1,'cv::FileNode::read(const FileNode &node, schar &value, schar default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a95512c3eba67570b9c1279e6f053972b',1,'cv::FileNode::read(const FileNode &node, ushort &value, ushort default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa9676bab54dc0ad11e3d7142b9a032b3',1,'cv::FileNode::read(const FileNode &node, short &value, short default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#acdd936a4632cc7b4f65836f701e7ccf9',1,'cv::FileNode::read(FileNodeIterator &it, std::vector< _Tp > &vec, size_t maxCount=(size_t) INT_MAX)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7ee12dcc6ea674d1f6a438703d948080',1,'cv::FileNode::read(const FileNode &node, _Tp &value, const _Tp &default_value=static_cast< _Tp >(0))'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a19b13d9369933709af74a8fd3c5e0d15',1,'cv::FileNode::read(const FileNode &node, std::vector< _Tp > &vec, const std::vector< _Tp > &default_value=std::vector< _Tp >())'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a75a16693d3fd15f0c6ddab1abd8ce273',1,'cv::FileNode::read(const FileNode &node, std::vector< KeyPoint > &vec, const std::vector< KeyPoint > &default_value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a82ddaf6232746691f81f232454d491ae',1,'cv::FileNode::read(const FileNode &node, std::vector< DMatch > &vec, const std::vector< DMatch > &default_value)'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a54caa24612b5b6840c2df65b924a557a',1,'cv::FlannBasedMatcher::read()'],['https://docs.opencv.org/4.2.0/da/dfe/classcv_1_1optflow_1_1GPCForest.html#ad1633ff926fe62db586c652c637db131',1,'cv::optflow::GPCForest::read()'],['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#a68f772c4b664f8de4cf659f1b71350b8',1,'cv::optflow::GPCTree::read()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a237a16a0646dc7a0dbecc52a93480aeb',1,'cv::HOGDescriptor::read()'],['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html#a2d2e8c65f8221a38af040dc1af44cb51',1,'cv::linemod::Modality::read()'],['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#a7cfb0e2099909b0cc2974aac34496b70',1,'cv::saliency::ObjectnessBING::read()'],['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html#ac903f40ca0b2258b539c0558027b426d',1,'cv::TrackerMIL::Params::read()'],['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#a52e884877e62b2f537019ce862def9c9',1,'cv::TrackerBoosting::Params::read()'],['https://docs.opencv.org/4.2.0/d3/dd0/structcv_1_1TrackerTLD_1_1Params.html#a2369615d47bda852ceec6d952bec83c7',1,'cv::TrackerTLD::Params::read()'],['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a4458dfc3b37adf04e2c07faa0987c897',1,'cv::TrackerKCF::Params::read()'],['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1TrackerGOTURN_1_1Params.html#a1fb841b478660ba3891285a69de6c9a3',1,'cv::TrackerGOTURN::Params::read()'],['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a3e7ef254cbdece115ef0f3465f21a2fa',1,'cv::TrackerCSRT::Params::read()'],['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#afa260d0b1970ef58b5054be28fec8ad6',1,'cv::TrackerMedianFlow::Params::read()'],['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#a4e4f1c37a478e954785ca256576c66d4',1,'cv::face::FacemarkAAM::Params::read()'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a3dfa6beeb73d6ee2777628167f7ed160',1,'cv::face::FacemarkLBF::Params::read()'],['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a5793ee4bf7c2aaa460d2ab873a896081',1,'cv::SimpleBlobDetector::Params::read()'],['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#ae3daad9a92b8aedc0c407bdd78232efc',1,'cv::line_descriptor::BinaryDescriptor::Params::read()'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#aa41a4bdd788b67e7e83de8c096f30816',1,'cv::PCA::read()'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a93659b6edcc1c48566e8170d771a097f',1,'cv::ppf_match_3d::PPF3DDetector::read()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#ae77d334f2a53aa913a016b08d67dc16a',1,'cv::ocl::Program::read()'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#acc8d168b3843059d4350b7731b980790',1,'cv::saliency::StaticSaliencySpectralResidual::read()'],['https://docs.opencv.org/4.2.0/d2/dc7/structcv_1_1linemod_1_1Template.html#aa2909fe07944c62dea884d698e5c4839',1,'cv::linemod::Template::read()'],['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a35ef833b72f25af2816ebed38ef1096e',1,'cv::Tracker::read()'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a473055e77dd7faa4d26d686226b292c1',1,'cv::VideoCapture::read()'],['https://docs.opencv.org/4.2.0/de/d0e/classcv_1_1xobjdetect_1_1WBDetector.html#aef2df760f45d25aade518196986e139f',1,'cv::xobjdetect::WBDetector::read()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'basic_iostream< char >::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'basic_iostream< char >::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'basic_istream< char >::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'basic_istream< char >::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'basic_istream< char, _Traits >::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'basic_istream< char, _Traits >::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_fstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_fstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_ifstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_ifstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_iostream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_iostream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_istream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_istream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_istringstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_istringstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_stringstream::read(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a9a4153b69895307ee9f18ebf08e0182a',1,'std::basic_stringstream::read(char_type *__s, streamsize __n)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a9afba2f5b9bf298c62da8cf66184e41f',1,'cv::read()'],['../group__camera.html#ga385fcc3b2e88c3692d7be7fb713a809a',1,'cam::read()']]], + ['read_5fonly_119',['READ_ONLY',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a6b2a295dc840db8b6728db2f3a439d6eaf1748d7175ce87c2b5b2be550bb7d4e6',1,'cv::ogl::Buffer::READ_ONLY'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a1010adb068498c191b8079323ad790f9af543648c468a8f8eeab540b84ed9fd2a',1,'cv::ocl::KernelArg::READ_ONLY']]], + ['read_5fonly_5fcache_120',['READ_ONLY_CACHE',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#abd18b22f05533504229e3ee358bb021ea53155ca25411d7e880b55b7114245f03',1,'cv::ocl::Device']]], + ['read_5fwrite_121',['READ_WRITE',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a6b2a295dc840db8b6728db2f3a439d6eaf254a35e198177eff9ecb1992ecf3e26',1,'cv::ogl::Buffer::READ_WRITE'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a1010adb068498c191b8079323ad790f9a7077dbb41d7964d5f68d9e033dcabfa3',1,'cv::ocl::KernelArg::READ_WRITE']]], + ['read_5fwrite_5fattributes_2emarkdown_122',['read_write_attributes.markdown',['https://docs.opencv.org/4.2.0/d9/d65/read__write__attributes_8markdown.html',1,'']]], + ['read_5fwrite_5fcache_123',['READ_WRITE_CACHE',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#abd18b22f05533504229e3ee358bb021ea8928cd5a8ec36e26d1c5239d6bfb2917',1,'cv::ocl::Device']]], + ['readcamera_124',['readCamera',['../namespacerobot.html#a2f3e430760dcde603cf49d380bfe5aba',1,'robot']]], + ['readclass_125',['readClass',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a4fc57692a360b0681e5f4515401c4713',1,'cv::linemod::Detector']]], + ['readclasses_126',['readClasses',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a3783f38548a7650e932240a86c9d3980',1,'cv::linemod::Detector']]], + ['readcloud_127',['readCloud',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga9711c507dba3d8ba11b0c6d845328abc',1,'cv::viz::readCloud()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga9711c507dba3d8ba11b0c6d845328abc',1,'readCloud()(Global Namespace)']]], + ['readconfigfromfile_128',['readConfigFromFile',['../group__camera.html#gab162965d19471ba55dd8126141ed702f',1,'cam']]], + ['readframe_129',['readFrame',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ae98be86ecab179c3862ec3a91c781394',1,'cv::AVIReadContainer']]], + ['readfromfilenode_130',['readFromFileNode',['../classcam_1_1CameraParams.html#a532633c3553a48c668c3f06729a7af70',1,'cam::CameraParams']]], + ['readfrommodeloptimizer_131',['readFromModelOptimizer',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a327720af187378a58e0a48feb0b5ef89',1,'cv::dnn::Net::readFromModelOptimizer(const String &xml, const String &bin)'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a7b162c8978d5b1aab599edbf59e5b79f',1,'cv::dnn::Net::readFromModelOptimizer(const std::vector< uchar > &bufferModelConfig, const std::vector< uchar > &bufferWeights)'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#af1fd3b20f8878e202d41d597b3da15d6',1,'cv::dnn::Net::readFromModelOptimizer(const uchar *bufferModelConfigPtr, size_t bufferModelConfigSize, const uchar *bufferWeightsPtr, size_t bufferWeightsSize)']]], + ['readgps_132',['readGPS',['../namespacerobot.html#a15b5204e1fdb2370d1b7eb627ec13924',1,'robot']]], + ['readgt_133',['readGT',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaabcd737c61fe63766554347f2a1859b9',1,'cv::ximgproc::readGT()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaabcd737c61fe63766554347f2a1859b9',1,'readGT()(Global Namespace)']]], + ['readimu_134',['readIMU',['../namespacerobot.html#a5a626747243a1f2ab9a842dc08399159',1,'robot']]], + ['readimuheading_135',['readIMUHeading',['../namespacerobot.html#aa11e482ffaef27ea65955d70d7eaa6a9',1,'robot']]], + ['reading_20and_20writing_136',['Image file reading and writing',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html',1,'']]], + ['reading_20and_20writing_20attributes_137',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]], + ['reading_20datasets_138',['Creating, Writing and Reading Datasets',['https://docs.opencv.org/4.2.0/d4/d93/tutorial_hdf_create_read_write_datasets.html',1,'']]], + ['reading_20geospatial_20raster_20files_20with_20gdal_139',['Reading Geospatial Raster files with GDAL',['https://docs.opencv.org/4.2.0/d7/d73/tutorial_raster_io_gdal.html',1,'']]], + ['readlandmarks_140',['readLandmarks',['../namespacerobot.html#acdba67256ee6b98d21f683ecf1acc9f0',1,'robot']]], + ['readme_2emd_141',['README.md',['https://docs.opencv.org/4.2.0/da/ddd/README_8md.html',1,'']]], + ['readmesh_142',['readMesh',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga2a9275114ec9184bb1814a29ffe00c62',1,'cv::viz::readMesh()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga2a9275114ec9184bb1814a29ffe00c62',1,'readMesh()(Global Namespace)']]], + ['readmodel_143',['readModel',['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1dnn__superres_1_1DnnSuperResImpl.html#aa4b84bf017d92ace7745bcd0c01e225a',1,'cv::dnn_superres::DnnSuperResImpl::readModel(const std::string &path)'],['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1dnn__superres_1_1DnnSuperResImpl.html#a2976d9f1eac620cb8940aa3acd65c06e',1,'cv::dnn_superres::DnnSuperResImpl::readModel(const std::string &weights, const std::string &definition)']]], + ['readnet_144',['readNet',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga3b34fe7a29494a6a4295c169a7d32422',1,'cv::dnn::readNet(const String &model, const String &config="", const String &framework="")'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga138439da76f26266fdefec9723f6c5cd',1,'cv::dnn::readNet(const String &framework, const std::vector< uchar > &bufferModel, const std::vector< uchar > &bufferConfig=std::vector< uchar >())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga3b34fe7a29494a6a4295c169a7d32422',1,'readNet(const String &model, const String &config="", const String &framework="")(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga138439da76f26266fdefec9723f6c5cd',1,'readNet(const String &framework, const std::vector< uchar > &bufferModel, const std::vector< uchar > &bufferConfig=std::vector< uchar >())(Global Namespace)']]], + ['readnetfromcaffe_145',['readNetFromCaffe',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga29d0ea5e52b1d1a6c2681e3f7d68473a',1,'cv::dnn::readNetFromCaffe(const String &prototxt, const String &caffeModel=String())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga5b1fd56ca658f10c3bd544ea46f57164',1,'cv::dnn::readNetFromCaffe(const std::vector< uchar > &bufferProto, const std::vector< uchar > &bufferModel=std::vector< uchar >())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga946b342af1355185a7107640f868b64a',1,'cv::dnn::readNetFromCaffe(const char *bufferProto, size_t lenProto, const char *bufferModel=NULL, size_t lenModel=0)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga29d0ea5e52b1d1a6c2681e3f7d68473a',1,'readNetFromCaffe(const String &prototxt, const String &caffeModel=String())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga5b1fd56ca658f10c3bd544ea46f57164',1,'readNetFromCaffe(const std::vector< uchar > &bufferProto, const std::vector< uchar > &bufferModel=std::vector< uchar >())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga946b342af1355185a7107640f868b64a',1,'readNetFromCaffe(const char *bufferProto, size_t lenProto, const char *bufferModel=NULL, size_t lenModel=0)(Global Namespace)']]], + ['readnetfromdarknet_146',['readNetFromDarknet',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gafde362956af949cce087f3f25c6aff0d',1,'cv::dnn::readNetFromDarknet(const String &cfgFile, const String &darknetModel=String())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gaef8ac647296804e79d463d0e14af8e9d',1,'cv::dnn::readNetFromDarknet(const std::vector< uchar > &bufferCfg, const std::vector< uchar > &bufferModel=std::vector< uchar >())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga351c327837e9e2d98035487695f74836',1,'cv::dnn::readNetFromDarknet(const char *bufferCfg, size_t lenCfg, const char *bufferModel=NULL, size_t lenModel=0)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gafde362956af949cce087f3f25c6aff0d',1,'readNetFromDarknet(const String &cfgFile, const String &darknetModel=String())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gaef8ac647296804e79d463d0e14af8e9d',1,'readNetFromDarknet(const std::vector< uchar > &bufferCfg, const std::vector< uchar > &bufferModel=std::vector< uchar >())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga351c327837e9e2d98035487695f74836',1,'readNetFromDarknet(const char *bufferCfg, size_t lenCfg, const char *bufferModel=NULL, size_t lenModel=0)(Global Namespace)']]], + ['readnetfrommodeloptimizer_147',['readNetFromModelOptimizer',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga4f3b552113d2bff48a54e168791c448e',1,'cv::dnn::readNetFromModelOptimizer(const String &xml, const String &bin)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gac3e76ebe0ac85f45144823be699c2023',1,'cv::dnn::readNetFromModelOptimizer(const std::vector< uchar > &bufferModelConfig, const std::vector< uchar > &bufferWeights)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gad2c5afab20a751d5ac2a587d607023d0',1,'cv::dnn::readNetFromModelOptimizer(const uchar *bufferModelConfigPtr, size_t bufferModelConfigSize, const uchar *bufferWeightsPtr, size_t bufferWeightsSize)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga4f3b552113d2bff48a54e168791c448e',1,'readNetFromModelOptimizer(const String &xml, const String &bin)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gac3e76ebe0ac85f45144823be699c2023',1,'readNetFromModelOptimizer(const std::vector< uchar > &bufferModelConfig, const std::vector< uchar > &bufferWeights)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gad2c5afab20a751d5ac2a587d607023d0',1,'readNetFromModelOptimizer(const uchar *bufferModelConfigPtr, size_t bufferModelConfigSize, const uchar *bufferWeightsPtr, size_t bufferWeightsSize)(Global Namespace)']]], + ['readnetfromonnx_148',['readNetFromONNX',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga7faea56041d10c71dbbd6746ca854197',1,'cv::dnn::readNetFromONNX(const String &onnxFile)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga9198ecaac7c32ddf0aa7a1bcbd359567',1,'cv::dnn::readNetFromONNX(const char *buffer, size_t sizeBuffer)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gac1a00e8bae54070e5837c15b1482997d',1,'cv::dnn::readNetFromONNX(const std::vector< uchar > &buffer)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga7faea56041d10c71dbbd6746ca854197',1,'readNetFromONNX(const String &onnxFile)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga9198ecaac7c32ddf0aa7a1bcbd359567',1,'readNetFromONNX(const char *buffer, size_t sizeBuffer)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gac1a00e8bae54070e5837c15b1482997d',1,'readNetFromONNX(const std::vector< uchar > &buffer)(Global Namespace)']]], + ['readnetfromtensorflow_149',['readNetFromTensorflow',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gad820b280978d06773234ba6841e77e8d',1,'cv::dnn::readNetFromTensorflow(const String &model, const String &config=String())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gac9b3890caab2f84790a17b306f36bd57',1,'cv::dnn::readNetFromTensorflow(const std::vector< uchar > &bufferModel, const std::vector< uchar > &bufferConfig=std::vector< uchar >())'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gacdba30a7c20db2788efbf5bb16a7884d',1,'cv::dnn::readNetFromTensorflow(const char *bufferModel, size_t lenModel, const char *bufferConfig=NULL, size_t lenConfig=0)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gad820b280978d06773234ba6841e77e8d',1,'readNetFromTensorflow(const String &model, const String &config=String())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gac9b3890caab2f84790a17b306f36bd57',1,'readNetFromTensorflow(const std::vector< uchar > &bufferModel, const std::vector< uchar > &bufferConfig=std::vector< uchar >())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gacdba30a7c20db2788efbf5bb16a7884d',1,'readNetFromTensorflow(const char *bufferModel, size_t lenModel, const char *bufferConfig=NULL, size_t lenConfig=0)(Global Namespace)']]], + ['readnetfromtorch_150',['readNetFromTorch',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga65a1da76cb7d6852bdf7abbd96f19084',1,'cv::dnn::readNetFromTorch()'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga65a1da76cb7d6852bdf7abbd96f19084',1,'readNetFromTorch()(Global Namespace)']]], + ['readonly_151',['ReadOnly',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a68b572e76caf0ba28d0f964e0d7b8f72',1,'cv::ocl::KernelArg']]], + ['readonlyaccessors_152',['ReadOnlyAccessors',['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5daa1f2b0e6a668b11f2958940965d2b572',1,'Eigen::ReadOnlyAccessors'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5daa1f2b0e6a668b11f2958940965d2b572',1,'ReadOnlyAccessors(Global Namespace)']]], + ['readonlynosize_153',['ReadOnlyNoSize',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a221bd893d50d9d0ec9b0b9e4eb3bb78e',1,'cv::ocl::KernelArg']]], + ['readopticalflow_154',['readOpticalFlow',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga957e09bfbb6c68af6d5a6c1b3312bf88',1,'cv::readOpticalFlow()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga957e09bfbb6c68af6d5a6c1b3312bf88',1,'readOpticalFlow()(Global Namespace)']]], + ['readpose_155',['readPose',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a2f939f6d87d559013d0a3d0ee02ede2a',1,'cv::ppf_match_3d::Pose3D::readPose(FILE *f)'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#ada48c63e8acabc8f2595f33de882b6cc',1,'cv::ppf_match_3d::Pose3D::readPose(const std::string &FileName)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gabaecbbd7c3d7208913394637f6dcd04a',1,'cv::viz::readPose()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gabaecbbd7c3d7208913394637f6dcd04a',1,'readPose()(Global Namespace)']]], + ['readposecluster_156',['readPoseCluster',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a096fbcd0d267046e291c1519c96a30f8',1,'cv::ppf_match_3d::PoseCluster3D::readPoseCluster(FILE *f)'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#aeb6137231fb62e3e3db11c17b5f720b9',1,'cv::ppf_match_3d::PoseCluster3D::readPoseCluster(const std::string &FileName)']]], + ['readraw_157',['readRaw',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a8c491ab24daea27a82a3b64b8b3b85a2',1,'cv::FileNode::readRaw()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#af355d7976305ca2784952a69b9af9b06',1,'cv::FileNodeIterator::readRaw()']]], + ['readsome_158',['readsome',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'basic_iostream< char >::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'basic_iostream< char >::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'basic_istream< char >::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'basic_istream< char >::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'basic_istream< char, _Traits >::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'basic_istream< char, _Traits >::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_fstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_fstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_ifstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_ifstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_iostream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_iostream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_istream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_istream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_istringstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_istringstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_stringstream::readsome(char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a1fab30041eadb65949ee4644e4db565d',1,'std::basic_stringstream::readsome(char_type *__s, streamsize __n)']]], + ['readtensorfromonnx_159',['readTensorFromONNX',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga8fe873b1b4746c3ceee80bebb16605d5',1,'cv::dnn::readTensorFromONNX()'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga8fe873b1b4746c3ceee80bebb16605d5',1,'readTensorFromONNX()(Global Namespace)']]], + ['readtorchblob_160',['readTorchBlob',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga70a86067eed7e495865cedc175ddba09',1,'cv::dnn::readTorchBlob()'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga70a86067eed7e495865cedc175ddba09',1,'readTorchBlob()(Global Namespace)']]], + ['readtrajectory_161',['readTrajectory',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga8b1eae0484d3d1cef27e3e8fa83aafd2',1,'cv::viz::readTrajectory()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga8b1eae0484d3d1cef27e3e8fa83aafd2',1,'readTrajectory()(Global Namespace)']]], + ['readwrite_162',['ReadWrite',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#aa169a58e85125b20514623871644be24',1,'cv::ocl::KernelArg']]], + ['readwritenosize_163',['ReadWriteNoSize',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a18172f202deb28c75eda860c6e93ce26',1,'cv::ocl::KernelArg']]], + ['ready_164',['ready',['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#aa2a0d471bf2aeab8e665efbfefd6446f',1,'cv::gapi::fluid::View::ready()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ab652f4a3bddd01d0c6f88246ea210eb2',1,'match_results< _Bi_iter >::ready()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ab652f4a3bddd01d0c6f88246ea210eb2',1,'std::match_results::ready()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4ab2fdab230a2c39f3595a947861863cb7',1,'ready(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4ab2fdab230a2c39f3595a947861863cb7',1,'ready(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4ab2fdab230a2c39f3595a947861863cb7',1,'ready(Global Namespace)']]], + ['real_165',['REAL',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a22a5db4ceb750ca68782ddb32f44562fa0643d2e20c5cb3a4120349e069db7232',1,'cv::ml::Boost::REAL'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a6742683e1af0c25240191f756e278c29',1,'cv::FileNode::REAL'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa8cf125b0e31559ba75a9d9b4f818a554',1,'REAL(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa8cf125b0e31559ba75a9d9b4f818a554',1,'REAL(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa8cf125b0e31559ba75a9d9b4f818a554',1,'REAL(Global Namespace)']]], + ['real_166',['real',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae46beda960c10cd574302b3bec63849c',1,'cv::FileNode::real()'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ac74dc920119b1eba45e9218d9f402afc',1,'Eigen::real()']]], + ['real_20time_20pose_20estimation_20of_20a_20textured_20object_167',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], + ['real_20world_20vision_168',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], + ['real_5ftime_5fpose_2emarkdown_169',['real_time_pose.markdown',['https://docs.opencv.org/4.2.0/dc/d83/real__time__pose_8markdown.html',1,'']]], + ['realqz_170',['RealQZ',['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html',1,'Eigen::RealQZ< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ac6e41c839f8dae31c9a3906ea7540119',1,'Eigen::RealQZ::RealQZ(const MatrixType &A, const MatrixType &B, bool computeQZ=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ad8fb9235870a8361a2fdd8dcc2e80d01',1,'Eigen::RealQZ::RealQZ(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ac6e41c839f8dae31c9a3906ea7540119',1,'RealQZ< MatrixType >::RealQZ(const MatrixType &A, const MatrixType &B, bool computeQZ=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ad8fb9235870a8361a2fdd8dcc2e80d01',1,'RealQZ< MatrixType >::RealQZ(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)']]], + ['realqz_3c_20matrixtype_20_3e_171',['RealQZ< MatrixType >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html',1,'']]], + ['realscalar_172',['RealScalar',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a5dae5f422a3c71060e6bd31332bf64fd',1,'Eigen::SelfAdjointEigenSolver::RealScalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af9f0234ebeae4c4ca512bcd5fb5e8bb1',1,'Eigen::SelfAdjointView::RealScalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af9f0234ebeae4c4ca512bcd5fb5e8bb1',1,'SelfAdjointView< const Derived, UpLo >::RealScalar']]], + ['realschur_173',['RealSchur',['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html',1,'Eigen::RealSchur< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#afef4d3dc5a493aca2760c20b34337016',1,'Eigen::RealSchur::RealSchur(const EigenBase< InputType > &matrix, bool computeU=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a826c83e2f1d4c8332606a14ea121ff5f',1,'Eigen::RealSchur::RealSchur(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#afef4d3dc5a493aca2760c20b34337016',1,'RealSchur< MatrixType >::RealSchur(const EigenBase< InputType > &matrix, bool computeU=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a826c83e2f1d4c8332606a14ea121ff5f',1,'RealSchur< MatrixType >::RealSchur(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)']]], + ['realschur_3c_20matrixtype_20_3e_174',['RealSchur< MatrixType >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html',1,'']]], + ['realvectortype_175',['RealVectorType',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#acd090d5fdfc3cc017a13b6d8daa92287',1,'Eigen::SelfAdjointEigenSolver']]], + ['rebind_176',['rebind',['https://docs.opencv.org/4.2.0/da/d52/classcv_1_1Allocator_1_1rebind.html',1,'cv::Allocator< class >::rebind'],['https://docs.opencv.org/4.2.0/d3/dd1/structcv_1_1cudev_1_1Avg_1_1rebind.html',1,'cv::cudev::Avg< class >::rebind'],['https://docs.opencv.org/4.2.0/d1/d7c/structcv_1_1cudev_1_1Max_1_1rebind.html',1,'cv::cudev::Max< class >::rebind'],['https://docs.opencv.org/4.2.0/d2/dff/structcv_1_1cudev_1_1Min_1_1rebind.html',1,'cv::cudev::Min< class >::rebind'],['https://docs.opencv.org/4.2.0/d1/d1d/structcv_1_1cudev_1_1Sum_1_1rebind.html',1,'cv::cudev::Sum::rebind< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06311.html#a623750ac65e5d54fc26075bc69af6081',1,'std::pointer_traits::rebind']]], + ['recentedge_177',['recentEdge',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a80cd8452cf0a0eb8fab9a6875a1bbd0f',1,'cv::Subdiv2D']]], + ['recip16s_178',['recip16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga772bb1fa1685d71849f79082a80fcc31',1,'cv::hal::recip16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga772bb1fa1685d71849f79082a80fcc31',1,'recip16s()(Global Namespace)']]], + ['recip16u_179',['recip16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8445f61e2f091b105828e8545478af6d',1,'cv::hal::recip16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8445f61e2f091b105828e8545478af6d',1,'recip16u()(Global Namespace)']]], + ['recip32f_180',['recip32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5b71f0bb6c0b759161073c2f7912d711',1,'cv::hal::recip32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5b71f0bb6c0b759161073c2f7912d711',1,'recip32f()(Global Namespace)']]], + ['recip32s_181',['recip32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9ec38966b1ad5b1e6310f072e9b9f88d',1,'cv::hal::recip32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9ec38966b1ad5b1e6310f072e9b9f88d',1,'recip32s()(Global Namespace)']]], + ['recip64f_182',['recip64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae19484a785495245c58d751824d9eb0f',1,'cv::hal::recip64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae19484a785495245c58d751824d9eb0f',1,'recip64f()(Global Namespace)']]], + ['recip8s_183',['recip8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga98afc67712c4d56b8c51e3c43d902e42',1,'cv::hal::recip8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga98afc67712c4d56b8c51e3c43d902e42',1,'recip8s()(Global Namespace)']]], + ['recip8u_184',['recip8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8c0cef82dafa61a600048b2ad488beba',1,'cv::hal::recip8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8c0cef82dafa61a600048b2ad488beba',1,'recip8u(const uchar *, size_t, const uchar *src2, size_t step2, uchar *dst, size_t step, int width, int height, void *scale)(Global Namespace)']]], + ['reciprocial_185',['Element-wise reciprocial',['https://docs.opencv.org/4.2.0/d4/de4/group__core__hal__interface__reciprocial.html',1,'']]], + ['recognition_186',['Recognition',['https://docs.opencv.org/4.2.0/d4/d8b/group__datasets__ar.html',1,'Action Recognition'],['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html',1,'Face Recognition'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html',1,'Gesture Recognition'],['https://docs.opencv.org/4.2.0/dc/d24/group__datasets__or.html',1,'Object Recognition'],['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'Scene Text Detection and Recognition'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html',1,'Scene Text Recognition'],['https://docs.opencv.org/4.2.0/db/d7b/group__datasets__tr.html',1,'Text Recognition']]], + ['recognition_20and_20pose_20estimation_20api_187',['3D object recognition and pose estimation API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'']]], + ['recognition_20with_20opencv_188',['Face Recognition with OpenCV',['https://docs.opencv.org/4.2.0/da/d60/tutorial_face_main.html',1,'']]], + ['reconstruct_189',['reconstruct',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a64eb8bb493d5c491e6d28ea04501c068',1,'cv::LDA::reconstruct()'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#ga279c084302ae1d7541d458e4b23fabd3',1,'cv::sfm::reconstruct(InputArrayOfArrays points2d, OutputArray Ps, OutputArray points3d, InputOutputArray K, bool is_projective=false)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#gaadb8cc60069485cbb9273b1efebd757d',1,'cv::sfm::reconstruct(InputArrayOfArrays points2d, OutputArray Rs, OutputArray Ts, InputOutputArray K, OutputArray points3d, bool is_projective=false)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#ga2d2661dc124447c3ff1c589eb8354768',1,'cv::sfm::reconstruct(const std::vector< String > images, OutputArray Ps, OutputArray points3d, InputOutputArray K, bool is_projective=false)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#gae4fb41e10f6d6bad54f2555fc8902dbb',1,'cv::sfm::reconstruct(const std::vector< String > images, OutputArray Rs, OutputArray Ts, InputOutputArray K, OutputArray points3d, bool is_projective=false)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#ga279c084302ae1d7541d458e4b23fabd3',1,'reconstruct(InputArrayOfArrays points2d, OutputArray Ps, OutputArray points3d, InputOutputArray K, bool is_projective=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#gaadb8cc60069485cbb9273b1efebd757d',1,'reconstruct(InputArrayOfArrays points2d, OutputArray Rs, OutputArray Ts, InputOutputArray K, OutputArray points3d, bool is_projective=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#ga2d2661dc124447c3ff1c589eb8354768',1,'reconstruct(const std::vector< String > images, OutputArray Ps, OutputArray points3d, InputOutputArray K, bool is_projective=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html#gae4fb41e10f6d6bad54f2555fc8902dbb',1,'reconstruct(const std::vector< String > images, OutputArray Rs, OutputArray Ts, InputOutputArray K, OutputArray points3d, bool is_projective=false)(Global Namespace)']]], + ['reconstruct_2ehpp_190',['reconstruct.hpp',['https://docs.opencv.org/4.2.0/d3/de1/reconstruct_8hpp.html',1,'']]], + ['reconstructedmatrix_191',['reconstructedMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a191a4f598b0c192a83ab48984e87ee51',1,'Eigen::FullPivLU::reconstructedMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#ae3693372ca29f50d87d324dfadaae148',1,'Eigen::LDLT::reconstructedMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a8b6ba1bc41811c50e65cac8db597d802',1,'Eigen::LLT::reconstructedMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#aba7f1ee83537b0d240ebf206503a4920',1,'Eigen::PartialPivLU::reconstructedMatrix()']]], + ['reconstruction_192',['Reconstruction',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html',1,'Camera Calibration and 3D Reconstruction'],['https://docs.opencv.org/4.2.0/d9/db7/tutorial_py_table_of_contents_calib3d.html',1,'Camera Calibration and 3D Reconstruction'],['https://docs.opencv.org/4.2.0/de/dfd/tutorial_sfm_import_reconstruction.html',1,'Import Reconstruction'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html',1,'Reconstruction'],['https://docs.opencv.org/4.2.0/d4/d18/tutorial_sfm_scene_reconstruction.html',1,'Scene Reconstruction']]], + ['reconstruction_193',['Custom Calibration Pattern for 3D reconstruction',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html',1,'']]], + ['reconstruction_20calib3d_20module_194',['Camera calibration and 3D reconstruction (calib3d module)',['https://docs.opencv.org/4.2.0/d6/d55/tutorial_table_of_content_calib3d.html',1,'']]], + ['record_195',['record',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#a81021ecb82ef875935c20f74f053d5c3',1,'cv::cuda::Event']]], + ['recordassetwriter_196',['recordAssetWriter',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#aa102efe4c203eeeeae7e87e163b00a04',1,'CvVideoCamera']]], + ['recordassetwriterinput_197',['recordAssetWriterInput',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#ac5d77802f8111ceac9c8e4a403139e01',1,'CvVideoCamera']]], + ['recordpixelbufferadaptor_198',['recordPixelBufferAdaptor',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#aca9dc5fa789ab937293e5208be7ed878',1,'CvVideoCamera']]], + ['recordvideo_199',['recordVideo',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#a7a2d067e74a18cd9cc5ee7626ac27660',1,'CvVideoCamera']]], + ['recoverpose_200',['recoverPose',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gadb7d2dfcc184c1d2f496d8639f4371c0',1,'cv::recoverPose(InputArray E, InputArray points1, InputArray points2, InputArray cameraMatrix, OutputArray R, OutputArray t, InputOutputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga40919d0c7eaf77b0df67dd76d5d24fa1',1,'cv::recoverPose(InputArray E, InputArray points1, InputArray points2, OutputArray R, OutputArray t, double focal=1.0, Point2d pp=Point2d(0, 0), InputOutputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga2ee9f187170acece29c5172c2175e7ae',1,'cv::recoverPose(InputArray E, InputArray points1, InputArray points2, InputArray cameraMatrix, OutputArray R, OutputArray t, double distanceThresh, InputOutputArray mask=noArray(), OutputArray triangulatedPoints=noArray())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gadb7d2dfcc184c1d2f496d8639f4371c0',1,'recoverPose(InputArray E, InputArray points1, InputArray points2, InputArray cameraMatrix, OutputArray R, OutputArray t, InputOutputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga40919d0c7eaf77b0df67dd76d5d24fa1',1,'recoverPose(InputArray E, InputArray points1, InputArray points2, OutputArray R, OutputArray t, double focal=1.0, Point2d pp=Point2d(0, 0), InputOutputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga2ee9f187170acece29c5172c2175e7ae',1,'recoverPose(InputArray E, InputArray points1, InputArray points2, InputArray cameraMatrix, OutputArray R, OutputArray t, double distanceThresh, InputOutputArray mask=noArray(), OutputArray triangulatedPoints=noArray())(Global Namespace)']]], + ['rect_201',['Rect',['https://docs.opencv.org/4.2.0/d3/d22/classcv_1_1gapi_1_1own_1_1Rect.html',1,'cv::gapi::own::Rect'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html',1,'cv::gapi::wip::draw::Rect'],['https://docs.opencv.org/4.2.0/d3/d22/classcv_1_1gapi_1_1own_1_1Rect.html#ab27b16b8f1d5dfba437462074c62df5e',1,'cv::gapi::own::Rect::Rect()=default'],['https://docs.opencv.org/4.2.0/d3/d22/classcv_1_1gapi_1_1own_1_1Rect.html#ac15c0e7711aef114842c03f626c6fc3f',1,'cv::gapi::own::Rect::Rect(int _x, int _y, int _width, int _height)'],['https://docs.opencv.org/4.2.0/d3/d22/classcv_1_1gapi_1_1own_1_1Rect.html#a0be75e61b2fbf5eb61304c2b289aba3e',1,'cv::gapi::own::Rect::Rect(const cv::Rect &other)'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html#aa462af8359a90be862f644cea5fe01b1',1,'cv::gapi::wip::draw::Rect::Rect()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga11d95de507098e90bad732b9345402e8',1,'cv::Rect'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga11d95de507098e90bad732b9345402e8',1,'Rect(Global Namespace)']]], + ['rect_202',['rect',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a08ac8ae42d4cbf36d67dcbe7e593e68c',1,'cv::text::ERStat::rect'],['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#a29828a29695992a325c0a4f1427b0318',1,'cv::CvHOGEvaluator::Feature::rect'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html#a869b446f1666163f953a2d1d77174c8f',1,'cv::CvLBPEvaluator::Feature::rect'],['https://docs.opencv.org/4.2.0/d7/de4/structcv_1_1dpm_1_1DPMDetector_1_1ObjectDetection.html#af1ee05059aabd53e22cdbda1a8443493',1,'cv::dpm::DPMDetector::ObjectDetection::rect'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html#ac75c091cf396bcca8d070134c808a5a7',1,'cv::gapi::wip::draw::Rect::rect'],['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#a4db258c3dea1221a7f2d89d79e124dae',1,'cv::tbm::TrackedObject::rect']]], + ['rect2d_203',['Rect2d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga894fe0940d40d4d65f008a2ca4e616bd',1,'cv::Rect2d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga894fe0940d40d4d65f008a2ca4e616bd',1,'Rect2d(Global Namespace)']]], + ['rect2f_204',['Rect2f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2d6c1acbbb651cf626f138748aac3d02',1,'cv::Rect2f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga2d6c1acbbb651cf626f138748aac3d02',1,'Rect2f(Global Namespace)']]], + ['rect2i_205',['Rect2i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaa87c8f580952d28b4127261994bce7d8',1,'cv::Rect2i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaa87c8f580952d28b4127261994bce7d8',1,'Rect2i(Global Namespace)']]], + ['rect_5f_206',['Rect_',['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html',1,'cv::Rect_< _Tp >'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#afb53dd5c7f9a57ecb3d50d62d2d6dd14',1,'cv::Rect_::Rect_()'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a5a41149f4b012b9f323b5913454375a1',1,'cv::Rect_::Rect_(_Tp _x, _Tp _y, _Tp _width, _Tp _height)'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a65947237f63dd8349884e0230835cf13',1,'cv::Rect_::Rect_(const Rect_ &r)'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#ad5650c613e0fee370c42e002acc9be8c',1,'cv::Rect_::Rect_(Rect_ &&r) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#ad03e77a67595ae76f241ac0a92b11bd3',1,'cv::Rect_::Rect_(const Point_< _Tp > &org, const Size_< _Tp > &sz)'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a388c33991cecd4942fe24a0cf32a4ad4',1,'cv::Rect_::Rect_(const Point_< _Tp > &pt1, const Point_< _Tp > &pt2)']]], + ['rectangle_207',['rectangle',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga07d2f74cadcf8e305e810ce8eed13bc9',1,'cv::rectangle(InputOutputArray img, Point pt1, Point pt2, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gac865734d137287c0afb7682ff7b3db23',1,'cv::rectangle(InputOutputArray img, Rect rec, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga07d2f74cadcf8e305e810ce8eed13bc9',1,'rectangle(InputOutputArray img, Point pt1, Point pt2, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gac865734d137287c0afb7682ff7b3db23',1,'rectangle(InputOutputArray img, Rect rec, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)']]], + ['rectanglesintersecttypes_208',['RectanglesIntersectTypes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaaf0eb9e10bd5adcbd446cd31fea2db68',1,'cv::RectanglesIntersectTypes'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaaf0eb9e10bd5adcbd446cd31fea2db68',1,'RectanglesIntersectTypes(Global Namespace)']]], + ['rectify3collinear_209',['rectify3Collinear',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gabd5437becb62abc0fe951c532a94b655',1,'cv::rectify3Collinear()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gabd5437becb62abc0fe951c532a94b655',1,'rectify3Collinear()(Global Namespace)']]], + ['rectify_5fcylindrical_210',['RECTIFY_CYLINDRICAL',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedea1c393e788481b0d3d430f34ca48c9b48',1,'cv::omnidir::RECTIFY_CYLINDRICAL'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedea1c393e788481b0d3d430f34ca48c9b48',1,'RECTIFY_CYLINDRICAL(Global Namespace)']]], + ['rectify_5flonglati_211',['RECTIFY_LONGLATI',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedeabe86f27bd18947404765e70eb9f90787',1,'cv::omnidir::RECTIFY_LONGLATI'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedeabe86f27bd18947404765e70eb9f90787',1,'RECTIFY_LONGLATI(Global Namespace)']]], + ['rectify_5fperspective_212',['RECTIFY_PERSPECTIVE',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedea31955c9ca6f1102df0d2149947194907',1,'cv::omnidir::RECTIFY_PERSPECTIVE'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedea31955c9ca6f1102df0d2149947194907',1,'RECTIFY_PERSPECTIVE(Global Namespace)']]], + ['rectify_5fstereographic_213',['RECTIFY_STEREOGRAPHIC',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedea6abf85110a5c5b2d8394442e22bdcb1d',1,'cv::omnidir::RECTIFY_STEREOGRAPHIC'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gga051919fbb966343c10c20de63855bedea6abf85110a5c5b2d8394442e22bdcb1d',1,'RECTIFY_STEREOGRAPHIC(Global Namespace)']]], + ['rectsize_214',['rectSize',['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html#aba52f3c8ba1f16655c33673ad90a1045',1,'cv::TrackerFeatureHAAR::Params']]], + ['rectstddev_215',['rectStdDev',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac311484a4e57cab2ce2cfdc195fda7ee',1,'cv::cuda::rectStdDev()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac311484a4e57cab2ce2cfdc195fda7ee',1,'rectStdDev()(Global Namespace)']]], + ['recurs_5ffilter_216',['RECURS_FILTER',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ggaf454b747a111dc9819419b99807ae7aca54c35da37a520d619d8a149d9b463d73',1,'cv::RECURS_FILTER'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ggaf454b747a111dc9819419b99807ae7aca54c35da37a520d619d8a149d9b463d73',1,'RECURS_FILTER(Global Namespace)']]], + ['recursive_217',['recursive',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298af8e45531a3ea3d5c1247b004985175a4',1,'recursive(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298af8e45531a3ea3d5c1247b004985175a4',1,'recursive(Global Namespace)']]], + ['recursive_5finit_5ferror_218',['recursive_init_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01655.html',1,'__gnu_cxx']]], + ['recursive_5fmutex_219',['recursive_mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02611.html',1,'std']]], + ['recursive_5ftimed_5fmutex_220',['recursive_timed_mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02619.html',1,'std']]], + ['red_221',['red',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1e1372991e755607437574ed62863701',1,'cv::viz::Color']]], + ['redirecterror_222',['redirectError',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga8cd28eccccb695570cdaf86a572d2c0c',1,'cv::redirectError()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga8cd28eccccb695570cdaf86a572d2c0c',1,'redirectError()(Global Namespace)']]], + ['reduce_223',['reduce',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga4b78072a303f29d9031d56e5638da78e',1,'cv::reduce()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga21d57f661db7be093caf2c4378be2007',1,'cv::cuda::reduce()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga4b78072a303f29d9031d56e5638da78e',1,'reduce(InputArray src, OutputArray dst, int dim, int rtype, int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga21d57f661db7be093caf2c4378be2007',1,'reduce(InputArray mtx, OutputArray vec, int dim, int reduceOp, int dtype=-1, Stream &stream=Stream::Null())(Global Namespace)']]], + ['reduce_2ehpp_224',['reduce.hpp',['https://docs.opencv.org/4.2.0/da/dca/modules_2core_2include_2opencv2_2core_2cuda_2detail_2reduce_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d78/modules_2core_2include_2opencv2_2core_2cuda_2reduce_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d33/contrib_2modules_2cudev_2include_2opencv2_2cudev_2block_2reduce_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d25/contrib_2modules_2cudev_2include_2opencv2_2cudev_2grid_2reduce_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/da3/contrib_2modules_2cudev_2include_2opencv2_2cudev_2warp_2reduce_8hpp.html',1,'(Global Namespace)']]], + ['reduce_5favg_225',['REDUCE_AVG',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a85f039992a454ca367bc190529766c7e',1,'cv::REDUCE_AVG'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a85f039992a454ca367bc190529766c7e',1,'REDUCE_AVG(Global Namespace)']]], + ['reduce_5fkey_5fval_2ehpp_226',['reduce_key_val.hpp',['https://docs.opencv.org/4.2.0/d3/dbd/reduce__key__val_8hpp.html',1,'']]], + ['reduce_5fmax_227',['REDUCE_MAX',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a928b4c3eb0a038ea41b61d122c0495ee',1,'cv::REDUCE_MAX'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a928b4c3eb0a038ea41b61d122c0495ee',1,'REDUCE_MAX(Global Namespace)']]], + ['reduce_5fmin_228',['REDUCE_MIN',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a1f40a2ed66c8a8b8198186da47ec7b76',1,'cv::REDUCE_MIN'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a1f40a2ed66c8a8b8198186da47ec7b76',1,'REDUCE_MIN(Global Namespace)']]], + ['reduce_5fsum_229',['REDUCE_SUM',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a101441e283ed69f20cfc5468114f9867',1,'cv::REDUCE_SUM'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga14cdedf2933367eb9395ec16798af994a101441e283ed69f20cfc5468114f9867',1,'REDUCE_SUM(Global Namespace)']]], + ['reduce_5fto_5fvec_2ehpp_230',['reduce_to_vec.hpp',['https://docs.opencv.org/4.2.0/d3/ddc/reduce__to__vec_8hpp.html',1,'']]], + ['reduceblock_231',['reduceBlock',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a0dc5e4cdaeaed5adb32bba9a92a4940e',1,'cv::cudev::NormHamming::reduceBlock()'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#aa92b2c0f877c54d3882c0b100fc34047',1,'cv::cudev::NormL1::reduceBlock()'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#a77368b8f3a5388c0d8aab169b148b8d9',1,'cv::cudev::NormL1< float >::reduceBlock()'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#ab5574d531bf6a65ce406741c921d0cf5',1,'cv::cudev::NormL2::reduceBlock()']]], + ['reducethread_232',['reduceThread',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#adac882811d25124956b6d8ddda1c7e74',1,'cv::cudev::NormHamming::reduceThread()'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#a8cf5faf0d148ffcbe8f7f860c4f2a957',1,'cv::cudev::NormL1::reduceThread()'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#a5b3bb11403b190f8d70acf26e4968337',1,'cv::cudev::NormL1< float >::reduceThread()'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#a61937ce719e08eb0a3260d0fad988a38',1,'cv::cudev::NormL2::reduceThread()']]], + ['reducetocolumn_5f_233',['reduceToColumn_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dce3e82ca9e9e5864749f753849f3ab',1,'cv::cudev::reduceToColumn_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dce3e82ca9e9e5864749f753849f3ab',1,'reduceToColumn_()(Global Namespace)']]], + ['reducetocolumnbody_234',['ReduceToColumnBody',['https://docs.opencv.org/4.2.0/d5/df4/structcv_1_1cudev_1_1ReduceToColumnBody.html',1,'cv::cudev']]], + ['reducetorow_5f_235',['reduceToRow_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba37f3bcb1334e0963fc6a4581c42676',1,'cv::cudev::reduceToRow_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba37f3bcb1334e0963fc6a4581c42676',1,'reduceToRow_()(Global Namespace)']]], + ['reducetorowbody_236',['ReduceToRowBody',['https://docs.opencv.org/4.2.0/da/d58/structcv_1_1cudev_1_1ReduceToRowBody.html',1,'cv::cudev']]], + ['reducetypes_237',['ReduceTypes',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga14cdedf2933367eb9395ec16798af994',1,'cv::ReduceTypes'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga14cdedf2933367eb9395ec16798af994',1,'ReduceTypes(Global Namespace)']]], + ['reducewarp_238',['reduceWarp',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a97c78787ce8b28690b52ee1d96b44ff5',1,'cv::cudev::NormHamming::reduceWarp()'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#a03732d5db6c696ea362cb2fc513a77df',1,'cv::cudev::NormL1::reduceWarp()'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#ae19f65c96ac924ee30eb993000c76c16',1,'cv::cudev::NormL1< float >::reduceWarp()'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#a48ce2566f027a78ceec676b4b17d36fe',1,'cv::cudev::NormL2::reduceWarp()']]], + ['reduction_2ehpp_239',['reduction.hpp',['https://docs.opencv.org/4.2.0/d2/da5/reduction_8hpp.html',1,'']]], + ['reductionratio_240',['reductionRatio',['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#a71a58b2c109e955cc3576bb1a89de952',1,'cv::line_descriptor::BinaryDescriptor::Params']]], + ['reductions_241',['Matrix Reductions',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html',1,'']]], + ['reductions_20visitors_20and_20broadcasting_242',['Reductions, visitors and broadcasting',['https://eigen.tuxfamily.org/dox/group__TutorialReductionsVisitorsBroadcasting.html',1,'']]], + ['redux_243',['redux',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a63ce1e4fab36bff43bbadcdd06a67724',1,'Eigen::DenseBase::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a63ce1e4fab36bff43bbadcdd06a67724',1,'DenseBase< ArrayWrapper< ExpressionType > >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a63ce1e4fab36bff43bbadcdd06a67724',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a63ce1e4fab36bff43bbadcdd06a67724',1,'DenseBase< Solve< Decomposition, RhsType > >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'Eigen::VectorwiseOp::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const Derived, Horizontal >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const Derived, Vertical >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::redux()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ae92babb33ed5a91eb0c4de80a97eafca',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::redux()']]], + ['ref_244',['Ref',['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref.html',1,'Eigen::Ref< class, Options, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref.html#a037addaa81f13e5765e30a92d2c4f2b1',1,'Eigen::Ref::Ref()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref.html#a037addaa81f13e5765e30a92d2c4f2b1',1,'Ref< const KLUMatrixType, StandardCompressedFormat >::Ref()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref.html#a037addaa81f13e5765e30a92d2c4f2b1',1,'Ref< const UmfpackMatrixType, StandardCompressedFormat >::Ref()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref_3_01SparseMatrixType_00_01Options_01_4.html#a5a27af935f839a42d85421f5cce99a68',1,'Eigen::Ref< SparseMatrixType, Options >::Ref()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref_3_01SparseVectorType_01_4.html#a125c83639030247f78157fa606c03f56',1,'Eigen::Ref< SparseVectorType >::Ref()']]], + ['ref_245',['ref',['https://docs.opencv.org/4.2.0/d4/d6a/structcv_1_1optflow_1_1GPCPatchSample.html#af4dc7f46ece01e93bbe2f75847f8275d',1,'cv::optflow::GPCPatchSample::ref'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a0e1e95540e8cc75976bb4be97dc2203e',1,'cv::SparseMat::ref(int i0, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a565a2111e6223af3d3e7d7af2db7588b',1,'cv::SparseMat::ref(int i0, int i1, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a8123bdba2899184e4946c82b2ddaa541',1,'cv::SparseMat::ref(int i0, int i1, int i2, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a31eeb43c5070301db9cba23bdb45ee11',1,'cv::SparseMat::ref(const int *idx, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a0e1e95540e8cc75976bb4be97dc2203e',1,'cv::SparseMat::ref(int i0, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a565a2111e6223af3d3e7d7af2db7588b',1,'cv::SparseMat::ref(int i0, int i1, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a8123bdba2899184e4946c82b2ddaa541',1,'cv::SparseMat::ref(int i0, int i1, int i2, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a31eeb43c5070301db9cba23bdb45ee11',1,'cv::SparseMat::ref(const int *idx, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a17c4339e51120f3f31a21f2d8145aa4a',1,'cv::SparseMat_::ref(int i0, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ab5627691b3f57c2f8be0a0c0a27178e7',1,'cv::SparseMat_::ref(int i0, int i1, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#aecb8e3bf1734c3c0ee967f3149aebe03',1,'cv::SparseMat_::ref(int i0, int i1, int i2, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ae7872bd52762f694af7f76251770de3e',1,'cv::SparseMat_::ref(const int *idx, size_t *hashval=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a1912c220e1851d8dd8484d3cb6317b33',1,'std::ref(_Tp &__t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab5fa68ff7314fb4425b6183fe9478a39',1,'std::ref(const _Tp &&)=delete'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa6e7c9ad5dbd731664fab89868983bc8',1,'std::ref(reference_wrapper< _Tp > __t) noexcept']]], + ['ref_3c_20const_20klumatrixtype_2c_20standardcompressedformat_20_3e_246',['Ref< const KLUMatrixType, StandardCompressedFormat >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref.html',1,'']]], + ['ref_3c_20const_20umfpackmatrixtype_2c_20standardcompressedformat_20_3e_247',['Ref< const UmfpackMatrixType, StandardCompressedFormat >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref.html',1,'']]], + ['ref_3c_20sparsematrixtype_2c_20options_20_3e_248',['Ref< SparseMatrixType, Options >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref_3_01SparseMatrixType_00_01Options_01_4.html',1,'Eigen']]], + ['ref_3c_20sparsevectortype_20_3e_249',['Ref< SparseVectorType >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Ref_3_01SparseVectorType_01_4.html',1,'Eigen']]], + ['refcount_250',['refcount',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#af528e8b675a72fd79ff1f399b7dd42df',1,'cv::cuda::GpuMat::refcount'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#acdcfa90051a2b0cc818ab61ea3f89f74',1,'cv::SparseMat::Hdr::refcount'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ae3e7ec959e9a6a3142d55f1896be1b6e',1,'cv::cuda::HostMem::refcount'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a21d534e3d518241614744ecf92119a84',1,'cv::UMatData::refcount']]], + ['reference_251',['Reference',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__Reference.html',1,'Reference'],['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__Reference.html',1,'Reference'],['https://eigen.tuxfamily.org/dox/group__Sparse__Reference.html',1,'Reference'],['https://eigen.tuxfamily.org/dox/group__Geometry__Reference.html',1,'Reference']]], + ['reference_252',['reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01827.html',1,'std::bitset< _Nb >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09791.html',1,'std::tr2::dynamic_bitset< _WordT, _Alloc >::reference'],['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#aedfc9a03a8436ad9e5eb43087218bc1c',1,'cv::Allocator::reference'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#adcdcae6ba6e9dd41264343403cde9fb4',1,'cv::MatConstIterator::reference'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a6718367fb9f2782d6e02f47d5ef4e9e3',1,'cv::MatConstIterator_::reference'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ab4f7e3e091002b4b6ae3f14919ff357d',1,'cv::MatIterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a00a0a67e9558dd2891dd4ddc9a568fab',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11631.html#a4ad1cd9fab408c3e3bb9aaac4fb02ca9',1,'__gnu_pbds::detail::bin_search_tree_node_it_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#adc01f11049fc8b3283d60458c4e2d04f',1,'__gnu_pbds::detail::binary_heap_const_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a28fd70badd5b824bf3269a0da6fe1765',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#ab5f6bb8d56264c9fa8c54b38ffda86ce',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a51d72ce957898641d2c4ccb57af15b36',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#aaf84a768bee3b8ec22ac16b461865bea',1,'const_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< input_iterator_tag, _CharT, _Traits::off_type, _CharT *, _CharT >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< input_iterator_tag, _Tp, _Dist, const _Tp *, const _Tp & >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< iterator_traits< _Iterator >::iterator_category, iterator_traits< _Iterator >::value_type, iterator_traits< _Iterator >::difference_type, iterator_traits< _Iterator >::pointer, iterator_traits< _Iterator >::reference >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< output_iterator_tag, void, void, void, void >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< std::output_iterator_tag, void, void, void, void >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< std::random_access_iterator_tag, _CharT >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'iterator< std::random_access_iterator_tag, bool >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a44c68d704c42fe7722c558da7f2072c8',1,'iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a28963e0d8e208b99c3de414baa3ac4de',1,'point_const_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#abe840ee0131ad7258892877c91ee8448',1,'point_iterator_::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::back_insert_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::front_insert_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::insert_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::istream_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::istreambuf_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::ostream_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::ostreambuf_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#abb17838f15d32971ad823036c6593aef',1,'std::raw_storage_iterator::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a9e362ba78518dfe70c4ea6159cae235a',1,'std::set::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a9e362ba78518dfe70c4ea6159cae235a',1,'std::set::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3e1eaafb2b3f1f11809491426d373485',1,'std::unordered_map::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3e1eaafb2b3f1f11809491426d373485',1,'std::unordered_map::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a08487e5381fd61795c61cfa0fed8e48f',1,'std::unordered_multimap::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a08487e5381fd61795c61cfa0fed8e48f',1,'std::unordered_multimap::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a81000aff43253d8859a4c59d35a89029',1,'std::unordered_multiset::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a81000aff43253d8859a4c59d35a89029',1,'std::unordered_multiset::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a111a313624cf9219526288500218d406',1,'std::unordered_set::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a111a313624cf9219526288500218d406',1,'std::unordered_set::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3e1eaafb2b3f1f11809491426d373485',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a3e1eaafb2b3f1f11809491426d373485',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::reference'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a220ae98554a76205fb7f8822d36b2d5a.html#a220ae98554a76205fb7f8822d36b2d5a',1,'nlohmann::basic_json::reference']]], + ['reference_20guide_253',['Quick reference guide',['https://eigen.tuxfamily.org/dox/group__QuickRefPage.html',1,'']]], + ['reference_20guide_20for_20sparse_20matrices_254',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], + ['reference_5fwrapper_255',['reference_wrapper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04235.html',1,'std']]], + ['referencing_20opencv_20from_20other_20doxygen_20projects_256',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], + ['referred_5ftype_257',['referred_type',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html#a240d245bd8371de57dfda3ece5b2bd1a',1,'cv::cudev::TypeTraits']]], + ['refine_5fintrinsics_258',['refine_intrinsics',['https://docs.opencv.org/4.2.0/d1/d61/classcv_1_1sfm_1_1libmv__ReconstructionOptions.html#ad29acc9d64442e328ce12495b24f1bb5',1,'cv::sfm::libmv_ReconstructionOptions']]], + ['refinedetectedmarkers_259',['refineDetectedMarkers',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga13a2742381c0a48e146d230a8cda2e66',1,'cv::aruco::refineDetectedMarkers()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga13a2742381c0a48e146d230a8cda2e66',1,'refineDetectedMarkers()(Global Namespace)']]], + ['refinement_5fmask_5f_260',['refinement_mask_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a56ea71911cc8a1693544f2f6a890ba73',1,'cv::detail::BundleAdjusterBase']]], + ['refinementmask_261',['refinementMask',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a78c3d35fb56343accaf1ee5fc9441713',1,'cv::detail::BundleAdjusterBase']]], + ['refwrap_2eh_262',['refwrap.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00464.html',1,'']]], + ['reg_5fdisable_263',['REG_DISABLE',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#ac3b362508385fbbeffac160e686d9c86aa12900650a9437f14dbbc050ea6dc55c',1,'cv::ml::LogisticRegression']]], + ['reg_5fl1_264',['REG_L1',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#ac3b362508385fbbeffac160e686d9c86a873eafcec3a7d20bd876352d52607795',1,'cv::ml::LogisticRegression']]], + ['reg_5fl2_265',['REG_L2',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#ac3b362508385fbbeffac160e686d9c86a93f8b6971edc02d1b7984b305b6ac17c',1,'cv::ml::LogisticRegression']]], + ['regex_266',['regex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00128.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga8fceaea413a55303731b390fbd660163',1,'std::regex'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga8fceaea413a55303731b390fbd660163',1,'regex(Global Namespace)']]], + ['regex_2eh_267',['regex.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00467.html',1,'']]], + ['regex_2etcc_268',['regex.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00470.html',1,'']]], + ['regex_5fautomaton_2eh_269',['regex_automaton.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00473.html',1,'']]], + ['regex_5fautomaton_2etcc_270',['regex_automaton.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00476.html',1,'']]], + ['regex_5fcompiler_2eh_271',['regex_compiler.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00479.html',1,'']]], + ['regex_5fcompiler_2etcc_272',['regex_compiler.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00482.html',1,'']]], + ['regex_5fconstants_2eh_273',['regex_constants.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00485.html',1,'']]], + ['regex_5ferror_274',['regex_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06867.html',1,'std::regex_error'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06867.html#a44d4ab569c3f1f9146b8cb4b1f4897c0',1,'std::regex_error::regex_error()']]], + ['regex_5ferror_2eh_275',['regex_error.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00488.html',1,'']]], + ['regex_5fexecutor_2eh_276',['regex_executor.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00491.html',1,'']]], + ['regex_5fexecutor_2etcc_277',['regex_executor.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00494.html',1,'']]], + ['regex_5fiterator_278',['regex_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html',1,'std::regex_iterator< class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a862caa6457b78a0ec1d477dfda124c5d',1,'std::regex_iterator::regex_iterator()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a656c2c42931bc138a1cc6e545cb16651',1,'std::regex_iterator::regex_iterator(_Bi_iter __a, _Bi_iter __b, const regex_type &__re, regex_constants::match_flag_type __m=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a6d2f585edf7bc1a45730ea200dabb86e',1,'std::regex_iterator::regex_iterator(const regex_iterator &)=default']]], + ['regex_5fmatch_279',['regex_match',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa55e272e1102f2c2d62d44bc39ca4ed3',1,'std::regex_match(_Bi_iter __s, _Bi_iter __e, match_results< _Bi_iter, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga56856a210c4b6150bb0b64dddcdc9578',1,'std::regex_match(_Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga801fe7c19ab7cf5bb7cbf7ff03c4e5eb',1,'std::regex_match(const _Ch_type *__s, match_results< const _Ch_type *, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __f=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga23ab0d8ecb63ccfb2f2130947f977c32',1,'std::regex_match(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &__s, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga79853ee819b851413b45e03e066c6b7b',1,'std::regex_match(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &&, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &, const basic_regex< _Ch_type, _Rx_traits > &, regex_constants::match_flag_type=regex_constants::match_default)=delete'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga975d1c6755647e1b45bddb5a6c3736bc',1,'std::regex_match(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __f=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gac9bdb8370891a6588cf4f75850236e53',1,'std::regex_match(const basic_string< _Ch_type, _Ch_traits, _Str_allocator > &__s, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa55e272e1102f2c2d62d44bc39ca4ed3',1,'regex_match(_Bi_iter __s, _Bi_iter __e, match_results< _Bi_iter, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga56856a210c4b6150bb0b64dddcdc9578',1,'regex_match(_Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga801fe7c19ab7cf5bb7cbf7ff03c4e5eb',1,'regex_match(const _Ch_type *__s, match_results< const _Ch_type *, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __f=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga23ab0d8ecb63ccfb2f2130947f977c32',1,'regex_match(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &__s, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga79853ee819b851413b45e03e066c6b7b',1,'regex_match(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &&, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &, const basic_regex< _Ch_type, _Rx_traits > &, regex_constants::match_flag_type=regex_constants::match_default)=delete(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga975d1c6755647e1b45bddb5a6c3736bc',1,'regex_match(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __f=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gac9bdb8370891a6588cf4f75850236e53',1,'regex_match(const basic_string< _Ch_type, _Ch_traits, _Str_allocator > &__s, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)']]], + ['regex_5freplace_280',['regex_replace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga92fc4fdd0f158a2779495ff609213cee',1,'std::regex_replace(_Out_iter __out, _Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__e, const basic_string< _Ch_type, _St, _Sa > &__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5e4ce407b27fd6d1d4502b6a47f48baa',1,'std::regex_replace(_Out_iter __out, _Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__e, const _Ch_type *__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga3bcb11315d31d20f37b9c1b78e030f90',1,'std::regex_replace(const basic_string< _Ch_type, _St, _Sa > &__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const basic_string< _Ch_type, _Fst, _Fsa > &__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gab2a4f515157ae835a3b2bfddc3d5ad5e',1,'std::regex_replace(const basic_string< _Ch_type, _St, _Sa > &__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const _Ch_type *__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gacd17678735431a5df3f0109050c15200',1,'std::regex_replace(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const basic_string< _Ch_type, _St, _Sa > &__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga90ecc0db56fc72636b31613801f8e738',1,'std::regex_replace(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const _Ch_type *__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga92fc4fdd0f158a2779495ff609213cee',1,'regex_replace(_Out_iter __out, _Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__e, const basic_string< _Ch_type, _St, _Sa > &__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5e4ce407b27fd6d1d4502b6a47f48baa',1,'regex_replace(_Out_iter __out, _Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__e, const _Ch_type *__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga3bcb11315d31d20f37b9c1b78e030f90',1,'regex_replace(const basic_string< _Ch_type, _St, _Sa > &__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const basic_string< _Ch_type, _Fst, _Fsa > &__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gab2a4f515157ae835a3b2bfddc3d5ad5e',1,'regex_replace(const basic_string< _Ch_type, _St, _Sa > &__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const _Ch_type *__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gacd17678735431a5df3f0109050c15200',1,'regex_replace(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const basic_string< _Ch_type, _St, _Sa > &__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga90ecc0db56fc72636b31613801f8e738',1,'regex_replace(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__e, const _Ch_type *__fmt, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)']]], + ['regex_5fscanner_2eh_281',['regex_scanner.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00497.html',1,'']]], + ['regex_5fscanner_2etcc_282',['regex_scanner.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00500.html',1,'']]], + ['regex_5fsearch_283',['regex_search',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gabe7986685f56116bf30c2f91d72ab9b6',1,'std::regex_search(_Bi_iter __s, _Bi_iter __e, match_results< _Bi_iter, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga66522d5eacabc953cc2e2512018b1eaf',1,'std::regex_search(_Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1c7c948a359f622835764f0c739095d1',1,'std::regex_search(const _Ch_type *__s, match_results< const _Ch_type *, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __f=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga74001d5fb6cc2788210770519eceed7d',1,'std::regex_search(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __f=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga295b45a2979a0b78d1f8cf3958a1a1a0',1,'std::regex_search(const basic_string< _Ch_type, _Ch_traits, _String_allocator > &__s, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __flags=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5d9b5360c3e14ab995f44a4f25a58b5e',1,'std::regex_search(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &__s, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __f=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5b3d18a746c2b6e12058e6769214a38c',1,'std::regex_search(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &&, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &, const basic_regex< _Ch_type, _Rx_traits > &, regex_constants::match_flag_type=regex_constants::match_default)=delete'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gabe7986685f56116bf30c2f91d72ab9b6',1,'regex_search(_Bi_iter __s, _Bi_iter __e, match_results< _Bi_iter, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga66522d5eacabc953cc2e2512018b1eaf',1,'regex_search(_Bi_iter __first, _Bi_iter __last, const basic_regex< _Ch_type, _Rx_traits > &__re, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1c7c948a359f622835764f0c739095d1',1,'regex_search(const _Ch_type *__s, match_results< const _Ch_type *, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __f=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga74001d5fb6cc2788210770519eceed7d',1,'regex_search(const _Ch_type *__s, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __f=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga295b45a2979a0b78d1f8cf3958a1a1a0',1,'regex_search(const basic_string< _Ch_type, _Ch_traits, _String_allocator > &__s, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __flags=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5d9b5360c3e14ab995f44a4f25a58b5e',1,'regex_search(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &__s, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &__m, const basic_regex< _Ch_type, _Rx_traits > &__e, regex_constants::match_flag_type __f=regex_constants::match_default)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5b3d18a746c2b6e12058e6769214a38c',1,'regex_search(const basic_string< _Ch_type, _Ch_traits, _Ch_alloc > &&, match_results< typename basic_string< _Ch_type, _Ch_traits, _Ch_alloc >::const_iterator, _Alloc > &, const basic_regex< _Ch_type, _Rx_traits > &, regex_constants::match_flag_type=regex_constants::match_default)=delete(Global Namespace)']]], + ['regex_5ftoken_5fiterator_284',['regex_token_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html',1,'std::regex_token_iterator< class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a8c4dd6b95c7ec9b573640afc5969ef1f',1,'std::regex_token_iterator::regex_token_iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#af7deee1721c6ee10358595d44e19435a',1,'std::regex_token_iterator::regex_token_iterator(_Bi_iter __a, _Bi_iter __b, const regex_type &__re, int __submatch=0, regex_constants::match_flag_type __m=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a53babd11badb91fd6a656a80013b4dcd',1,'std::regex_token_iterator::regex_token_iterator(_Bi_iter __a, _Bi_iter __b, const regex_type &__re, const std::vector< int > &__submatches, regex_constants::match_flag_type __m=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a55751b985986e1d848bf38628888b40c',1,'std::regex_token_iterator::regex_token_iterator(_Bi_iter __a, _Bi_iter __b, const regex_type &__re, initializer_list< int > __submatches, regex_constants::match_flag_type __m=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a035a02e7d0ca95caa7bbd96f5e333d77',1,'std::regex_token_iterator::regex_token_iterator(_Bi_iter __a, _Bi_iter __b, const regex_type &__re, const int(&__submatches)[_Nm], regex_constants::match_flag_type __m=regex_constants::match_default)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a32e6d85c9cd633eeb2ef43d63e54de5f',1,'std::regex_token_iterator::regex_token_iterator(const regex_token_iterator &__rhs)']]], + ['regex_5ftraits_285',['regex_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html',1,'std::regex_traits< _Ch_type >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a4db88d5c982e69fbd0202c02de2f714a',1,'regex_traits< _CharType >::regex_traits()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a4db88d5c982e69fbd0202c02de2f714a',1,'std::regex_traits::regex_traits()']]], + ['regex_5ftraits_3c_20_5fchartype_20_3e_286',['regex_traits< _CharType >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html',1,'']]], + ['regionlayer_287',['RegionLayer',['https://docs.opencv.org/4.2.0/d1/d21/classcv_1_1dnn_1_1RegionLayer.html',1,'cv::dnn']]], + ['register_5fcallback_288',['register_callback',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'basic_ios< char, _Traits >::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'basic_iostream< char >::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'basic_istream< char >::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'basic_istream< char, _Traits >::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'basic_ostream< char >::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'basic_ostream< char, _Traits >::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_fstream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_ifstream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_ios::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_iostream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_istream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_istringstream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_ofstream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_ostream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_ostringstream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::basic_stringstream::register_callback()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a54948c4f38526937d510af5670ae368a',1,'std::ios_base::register_callback()']]], + ['registerdepth_289',['registerDepth',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0df0ea008a0a040251180f498adb6609',1,'cv::rgbd::registerDepth()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0df0ea008a0a040251180f498adb6609',1,'registerDepth()(Global Namespace)']]], + ['registerkeyboardcallback_290',['registerKeyboardCallback',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#af9796161c280e19cde7e01941d26f35b',1,'cv::viz::Viz3d']]], + ['registerlayer_291',['registerLayer',['https://docs.opencv.org/4.2.0/d4/d67/classcv_1_1dnn_1_1LayerFactory.html#aca69c92ed171a3a1e4ea38f28be20252',1,'cv::dnn::LayerFactory']]], + ['registerlogtag_292',['registerLogTag',['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html#gabbf1817c13a329597611628569270906',1,'cv::utils::logging::registerLogTag()'],['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html#gabbf1817c13a329597611628569270906',1,'registerLogTag()(Global Namespace)']]], + ['registermodeltoscene_293',['registerModelToScene',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1ppf__match__3d_1_1ICP.html#accd9744cedf9cd9cd175d2c5bd77951e',1,'cv::ppf_match_3d::ICP::registerModelToScene(const Mat &srcPC, const Mat &dstPC, double &residual, Matx44d &pose)'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1ppf__match__3d_1_1ICP.html#ab45e66bf4453badc77a4b0e1524673cf',1,'cv::ppf_match_3d::ICP::registerModelToScene(const Mat &srcPC, const Mat &dstPC, std::vector< Pose3DPtr > &poses)']]], + ['registermousecallback_294',['registerMouseCallback',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a1296209cdb8ade50e8a8ad38f1b792cc',1,'cv::viz::Viz3d']]], + ['registerpagelocked_295',['registerPageLocked',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga6d25da8194cc95035994ae98e9eebc02',1,'cv::cuda::registerPageLocked()'],['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga6d25da8194cc95035994ae98e9eebc02',1,'registerPageLocked(Mat &m)(Global Namespace)']]], + ['registration_296',['Registration',['https://docs.opencv.org/4.2.0/dc/def/group__datasets__ir.html',1,'Image Registration'],['https://docs.opencv.org/4.2.0/db/d61/group__reg.html',1,'Image Registration'],['https://docs.opencv.org/4.2.0/df/dc1/group__dnnLayerFactory.html',1,'Utilities for New Layers Registration']]], + ['registrationresol_297',['registrationResol',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a9b90774eabdf68c9ee864918d620538d',1,'cv::Stitcher']]], + ['registry_298',['Query I/O API backends registry',['https://docs.opencv.org/4.2.0/de/db1/group__videoio__registry.html',1,'']]], + ['registry_2ehpp_299',['registry.hpp',['https://docs.opencv.org/4.2.0/d1/da2/registry_8hpp.html',1,'']]], + ['regkinds_300',['RegKinds',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#ac3b362508385fbbeffac160e686d9c86',1,'cv::ml::LogisticRegression']]], + ['regsperblock_301',['regsPerBlock',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#af50b748a77d4fb04cffac350628db957',1,'cv::cuda::DeviceInfo']]], + ['regular_302',['REGULAR',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#aa2a27f17a1a30fad4c54c248b77777e0a9904ebe58740486ab511151a7b9067fd',1,'cv::xfeatures2d::PCTSignatures']]], + ['regular_20expressions_303',['Regular Expressions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html',1,'']]], + ['rehash_304',['rehash',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af81fbed78a715d3c81e8c7655669c7e7',1,'std::unordered_map::rehash()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac9032d22474fc3c5ec4d0b74362b5f4e',1,'std::unordered_multimap::rehash()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a12c1bfb9feb07236289dcf324b841d58',1,'std::unordered_multiset::rehash()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a6f3606a68d349ec1e1e5de56116a39fd',1,'std::unordered_set::rehash()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af81fbed78a715d3c81e8c7655669c7e7',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::rehash()']]], + ['reid_5fthr_305',['reid_thr',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a1b924a1497825d64c7a369fdb9d766a7',1,'cv::tbm::TrackerParams']]], + ['reinterpret_5ffrom_5fint_306',['reinterpret_from_int',['https://docs.opencv.org/4.2.0/d5/d9e/structcv_1_1V__TypeTraits_3_01double_01_4.html#af27e343945e0160e661daae8b45d0092',1,'cv::V_TypeTraits< double >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/da/d19/structcv_1_1V__TypeTraits_3_01float_01_4.html#ab36a4a7b6e20628b2661af4c4fd9156f',1,'cv::V_TypeTraits< float >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/db/d59/structcv_1_1V__TypeTraits_3_01int64_01_4.html#a1e2bfbeb7c75902de3ded8cf5adbe587',1,'cv::V_TypeTraits< int64 >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/d0/d9d/structcv_1_1V__TypeTraits_3_01schar_01_4.html#ae21c7e3916f07f7476f5896d1ce8ee78',1,'cv::V_TypeTraits< schar >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1V__TypeTraits_3_01short_01_4.html#a504a9f8b85ea342c968294d4b8cccbcb',1,'cv::V_TypeTraits< short >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/dd/d1d/structcv_1_1V__TypeTraits_3_01uchar_01_4.html#ab8d70c37b16112590d2256759f69702c',1,'cv::V_TypeTraits< uchar >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/d2/d4d/structcv_1_1V__TypeTraits_3_01uint64_01_4.html#adf44315323474d6be746c869343dbc84',1,'cv::V_TypeTraits< uint64 >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/d3/d8c/structcv_1_1V__TypeTraits_3_01unsigned_01_4.html#a492a401f025a424cc81514ecb94f910f',1,'cv::V_TypeTraits< unsigned >::reinterpret_from_int()'],['https://docs.opencv.org/4.2.0/d6/dd5/structcv_1_1V__TypeTraits_3_01ushort_01_4.html#a27fc724985045646604f0f4275b9ef9f',1,'cv::V_TypeTraits< ushort >::reinterpret_from_int()']]], + ['reinterpret_5fint_307',['reinterpret_int',['https://docs.opencv.org/4.2.0/d5/d9e/structcv_1_1V__TypeTraits_3_01double_01_4.html#a3e26770e96b8fb79b5b464daf02fd8e6',1,'cv::V_TypeTraits< double >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/da/d19/structcv_1_1V__TypeTraits_3_01float_01_4.html#abca889cc30ca197d1d37b6d2ac675c56',1,'cv::V_TypeTraits< float >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/db/d59/structcv_1_1V__TypeTraits_3_01int64_01_4.html#af4592c2a50ebab7496a18cfa357d6954',1,'cv::V_TypeTraits< int64 >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/d0/d9d/structcv_1_1V__TypeTraits_3_01schar_01_4.html#a1a9a3fbd322f1b6840249b68e89837b4',1,'cv::V_TypeTraits< schar >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1V__TypeTraits_3_01short_01_4.html#aedf2ae31fb492278e2f2fef55809ad72',1,'cv::V_TypeTraits< short >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/dd/d1d/structcv_1_1V__TypeTraits_3_01uchar_01_4.html#a48527cde16dc8cdaed021c021d2ccf32',1,'cv::V_TypeTraits< uchar >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/d2/d4d/structcv_1_1V__TypeTraits_3_01uint64_01_4.html#a13d2344b5309b14932e03ca49d869c1e',1,'cv::V_TypeTraits< uint64 >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/d3/d8c/structcv_1_1V__TypeTraits_3_01unsigned_01_4.html#a1cc7327773b9c215d313ad88d62a8ddd',1,'cv::V_TypeTraits< unsigned >::reinterpret_int()'],['https://docs.opencv.org/4.2.0/d6/dd5/structcv_1_1V__TypeTraits_3_01ushort_01_4.html#a21496198a32d59b5469c5abd536a579b',1,'cv::V_TypeTraits< ushort >::reinterpret_int()']]], + ['relativecameramotion_308',['relativeCameraMotion',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gae9ad20b15801475977147475eef82626',1,'cv::sfm::relativeCameraMotion()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gae9ad20b15801475977147475eef82626',1,'relativeCameraMotion()(Global Namespace)']]], + ['release_309',['release',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a827011c86f30a391123e91e4f776c9f2',1,'cv::_OutputArray::release()'],['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a19c5d9d13d6f234b507ab98c4a8e23f4',1,'cv::ogl::Arrays::release()'],['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a801cbd8a4db7b4d2e01a8c7a37acdb0f',1,'cv::AsyncArray::release()'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#a5373c68ea688b275771e5fe61a205b7f',1,'cv::AsyncPromise::release()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#aae8efb43bb0ece5deffc68308bb70b53',1,'cv::ogl::Buffer::release()'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ad23d5415a06fb4bc97bfa034589b376e',1,'cv::FileStorage::release()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a460951a00945774e9da0b1062ea0a319',1,'cv::cuda::GpuMat::release()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a924b94dc7a70dd17d8c38e0de48ab827',1,'cv::cuda::HostMem::release()'],['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1utils_1_1lock__guard.html#adb7b5ff1eee9bb34cc15a64cbd86cf15',1,'cv::utils::lock_guard::release()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ae48d4913285518e2c21a3457017e716e',1,'cv::Mat::release()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac17505e5b9b1eb27adcfc96cfaff93eb',1,'cv::Mat_::release()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac17505e5b9b1eb27adcfc96cfaff93eb',1,'Mat_< double >::release()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac17505e5b9b1eb27adcfc96cfaff93eb',1,'Mat_< float >::release()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac17505e5b9b1eb27adcfc96cfaff93eb',1,'Mat_< uchar >::release()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac17505e5b9b1eb27adcfc96cfaff93eb',1,'Mat_< unsigned char >::release()'],['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a53c86a62034b699eac5385314a09338f',1,'cv::rgbd::OdometryFrame::release()'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#ad114b1c257b15826a9b1122278054a44',1,'cv::rgbd::RgbdFrame::release()'],['https://docs.opencv.org/4.2.0/d9/d7f/classcv_1_1utils_1_1shared__lock__guard.html#ad5b2c93e6f569b30067b476b26a65be9',1,'cv::utils::shared_lock_guard::release()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a3f4c162afd8cc809d23bd0fe9b38ead7',1,'cv::SparseMat::release()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a91376169e9cf05898fdecc025a8cbb4c',1,'cv::ogl::Texture2D::release()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#aa3e2204675be100726e6088d8e34214a',1,'cv::TLSDataAccumulator::release()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#aa3e2204675be100726e6088d8e34214a',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::release()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#af8c2c374fb21c3bf8421e28290df3630',1,'cv::TLSDataContainer::release()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aa9a894abdfd44e72ef37a4fc10f3481b',1,'cv::UMat::release()'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#afb4ab689e553ba2c8f0fec41b9344ae6',1,'cv::VideoCapture::release()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a667f737e56d5ba6b0533c6c7bf941140',1,'cv::VideoWriter::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a3cdeabd85acfcac56136924e939c29ef',1,'std::auto_ptr::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#af40585665f237aca4a3364726b3fdb1d',1,'std::unique_ptr::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a2738fbe9d4c7a5c93ae36f40ce4794f8',1,'std::unique_ptr< _Tp[], _Dp >::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#af40585665f237aca4a3364726b3fdb1d',1,'unique_ptr< _Codecvt >::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#af40585665f237aca4a3364726b3fdb1d',1,'unique_ptr< _Res_type >::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#af40585665f237aca4a3364726b3fdb1d',1,'unique_ptr< _Result< _Res > >::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#af40585665f237aca4a3364726b3fdb1d',1,'unique_ptr< _Result_base >::release()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#af40585665f237aca4a3364726b3fdb1d',1,'unique_ptr< bool[]>::release()']]], + ['releaseandgetstring_310',['releaseAndGetString',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a5341a9e09e1b797faf6b7ec40bd558fd',1,'cv::FileStorage']]], + ['releasebitstream_311',['releaseBitStream',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1cudacodec_1_1EncoderCallBack.html#a2eb0f4b44dec63bb43a1eadfcf18bd63',1,'cv::cudacodec::EncoderCallBack']]], + ['releasememory_312',['releaseMemory',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a500401e692acadfd0952362d9519f41f',1,'cv::cuda::SURF_CUDA']]], + ['releasepyramids_313',['releasePyramids',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a517d6c7faa6f010b88e3c9a6a56ccacd',1,'cv::rgbd::OdometryFrame']]], + ['relu_314',['RELU',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ade71470ec8814021728f8b31b09773b0ae206e366e80a947e72df5c149fd74c42',1,'cv::ml::ANN_MLP']]], + ['relu6layer_315',['ReLU6Layer',['https://docs.opencv.org/4.2.0/dc/dcd/classcv_1_1dnn_1_1ReLU6Layer.html',1,'cv::dnn']]], + ['relulayer_316',['ReLULayer',['https://docs.opencv.org/4.2.0/dd/df0/classcv_1_1dnn_1_1ReLULayer.html',1,'cv::dnn']]], + ['remaining_317',['remaining',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a312b069f6804aa1a5d75d6c32bf5751d',1,'cv::FileNodeIterator']]], + ['remap_318',['remap',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gab75ef31ce5cdfb5c44b6da5f3b908ea4',1,'cv::remap()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga0ece6c76e8efa3171adb8432d842beb0',1,'cv::cuda::remap()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gac2c8de7ed8e75e46516246a8365b6298',1,'cv::gapi::remap()'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#gab75ef31ce5cdfb5c44b6da5f3b908ea4',1,'remap(InputArray src, OutputArray dst, InputArray map1, InputArray map2, int interpolation, int borderMode=BORDER_CONSTANT, const Scalar &borderValue=Scalar())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gac2c8de7ed8e75e46516246a8365b6298',1,'remap(const GMat &src, const Mat &map1, const Mat &map2, int interpolation, int borderMode=BORDER_CONSTANT, const Scalar &borderValue=Scalar())(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga0ece6c76e8efa3171adb8432d842beb0',1,'remap(InputArray src, OutputArray dst, InputArray xmap, InputArray ymap, int interpolation, int borderMode=BORDER_CONSTANT, Scalar borderValue=Scalar(), Stream &stream=Stream::Null())(Global Namespace)']]], + ['remap_2ehpp_319',['remap.hpp',['https://docs.opencv.org/4.2.0/d1/d59/remap_8hpp.html',1,'']]], + ['remap_2emarkdown_320',['remap.markdown',['https://docs.opencv.org/4.2.0/df/ded/remap_8markdown.html',1,'']]], + ['remap_5f_321',['remap_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7846d77d4e620309c4948f67637a9dce',1,'cv::cudev::remap_(const SrcPtr &src, const MapPtr &map)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0dde1636c62b809cd4bf531ea429acfa',1,'cv::cudev::remap_(const SrcPtr &src, const MapXPtr &mapx, const MapYPtr &mapy)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7846d77d4e620309c4948f67637a9dce',1,'remap_(const SrcPtr &src, const MapPtr &map)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0dde1636c62b809cd4bf531ea429acfa',1,'remap_(const SrcPtr &src, const MapXPtr &mapx, const MapYPtr &mapy)(Global Namespace)']]], + ['remapping_322',['Remapping',['https://docs.opencv.org/4.2.0/d1/da0/tutorial_remap.html',1,'']]], + ['remapptr_323',['remapPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c0175ccc5581a982dc6c801f9ee81f9',1,'cv::cudev::remapPtr(const SrcPtr &src, const MapPtr &map)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65fadb00994fa6ccdbe3b17c1e742900',1,'cv::cudev::remapPtr(const SrcPtr &src, const MapXPtr &mapx, const MapYPtr &mapy)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c0175ccc5581a982dc6c801f9ee81f9',1,'remapPtr(const SrcPtr &src, const MapPtr &map)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65fadb00994fa6ccdbe3b17c1e742900',1,'remapPtr(const SrcPtr &src, const MapXPtr &mapx, const MapYPtr &mapy)(Global Namespace)']]], + ['remapptr1_324',['RemapPtr1',['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html',1,'cv::cudev']]], + ['remapptr1sz_325',['RemapPtr1Sz',['https://docs.opencv.org/4.2.0/dd/d03/structcv_1_1cudev_1_1RemapPtr1Sz.html',1,'cv::cudev']]], + ['remapptr2_326',['RemapPtr2',['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html',1,'cv::cudev']]], + ['remapptr2sz_327',['RemapPtr2Sz',['https://docs.opencv.org/4.2.0/d4/d59/structcv_1_1cudev_1_1RemapPtr2Sz.html',1,'cv::cudev']]], + ['remove_328',['remove',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#aef7392cdc72aafbd304abf42b15f98fb',1,'cv::gapi::GKernelPackage::remove(const GBackend &backend)'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#a3ec294d11a28bc25b8e4b60e94d67a1f',1,'cv::gapi::GKernelPackage::remove()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7e31cf919e63de611522d32e301e75b8',1,'list< __inp, __rebind_inp >::remove()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aa9b3162769904b5c710868fa13e9b8b9',1,'std::forward_list::remove()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7e31cf919e63de611522d32e301e75b8',1,'std::list::remove()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga166f118ed07d6a2dd58c9bbdd7c0f5b5',1,'std::remove()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga166f118ed07d6a2dd58c9bbdd7c0f5b5',1,'remove()(Global Namespace)']]], + ['remove_5fall_329',['remove_all',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#a5c23a1bc36782e9d9e58959e8ed1176e',1,'cv::utils::fs']]], + ['remove_5fall_5fextents_330',['remove_all_extents',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03519.html',1,'std']]], + ['remove_5fall_5fextents_5ft_331',['remove_all_extents_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga3bc0ff8d42850eabb6bcbe2440a844ff',1,'std::remove_all_extents_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga3bc0ff8d42850eabb6bcbe2440a844ff',1,'remove_all_extents_t(Global Namespace)']]], + ['remove_5fconst_332',['remove_const',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03919.html',1,'std']]], + ['remove_5fconst_5ft_333',['remove_const_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga4e79124b56e4ce8037d87387898b9d1f',1,'std::remove_const_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga4e79124b56e4ce8037d87387898b9d1f',1,'remove_const_t(Global Namespace)']]], + ['remove_5fcopy_334',['remove_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga6118d2d397ae6ad3b11604c6eb843a31',1,'std::remove_copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga6118d2d397ae6ad3b11604c6eb843a31',1,'remove_copy()(Global Namespace)']]], + ['remove_5fcopy_5fif_335',['remove_copy_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga80d825ff82bc980758c885296cec1fb1',1,'std::remove_copy_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga80d825ff82bc980758c885296cec1fb1',1,'remove_copy_if()(Global Namespace)']]], + ['remove_5fcv_336',['remove_cv',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03115.html',1,'std']]], + ['remove_5fcv_5ft_337',['remove_cv_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga33d8994a84545d04adc29f8be0d12122',1,'std::remove_cv_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga33d8994a84545d04adc29f8be0d12122',1,'remove_cv_t(Global Namespace)']]], + ['remove_5fextent_338',['remove_extent',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04143.html',1,'std']]], + ['remove_5fextent_5ft_339',['remove_extent_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#gaa9f31e8838657e142868524eca599817',1,'std::remove_extent_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#gaa9f31e8838657e142868524eca599817',1,'remove_extent_t(Global Namespace)']]], + ['remove_5fif_340',['remove_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ab31cebd10d04a7e69803d9cd55716213',1,'list< __inp, __rebind_inp >::remove_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a7c7f79f92d9199ce7245925b27621304',1,'std::forward_list::remove_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ab31cebd10d04a7e69803d9cd55716213',1,'std::list::remove_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga80cc02d9d8e0975b92933a90579b3678',1,'std::remove_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga80cc02d9d8e0975b92933a90579b3678',1,'remove_if(_ForwardIterator __first, _ForwardIterator __last, _Predicate __pred)(Global Namespace)']]], + ['remove_5fperms_341',['remove_perms',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145aa3ecbf595d87a84cbb691ea29ddb65ca',1,'remove_perms(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145aa3ecbf595d87a84cbb691ea29ddb65ca',1,'remove_perms(Global Namespace)']]], + ['remove_5fpointer_342',['remove_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04171.html',1,'std']]], + ['remove_5fpointer_5ft_343',['remove_pointer_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga46cd3040e1bdad121ab1668a69a662ff',1,'std::remove_pointer_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga46cd3040e1bdad121ab1668a69a662ff',1,'remove_pointer_t(Global Namespace)']]], + ['remove_5freference_344',['remove_reference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03947.html',1,'std']]], + ['remove_5freference_5ft_345',['remove_reference_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga05f704b8440a5839204308c83a07748f',1,'std::remove_reference_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga05f704b8440a5839204308c83a07748f',1,'remove_reference_t(Global Namespace)']]], + ['remove_5fvolatile_346',['remove_volatile',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03927.html',1,'std']]], + ['remove_5fvolatile_5ft_347',['remove_volatile_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga7227cba5288e88d88468df26c3200885',1,'std::remove_volatile_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga7227cba5288e88d88468df26c3200885',1,'remove_volatile_t(Global Namespace)']]], + ['removealllights_348',['removeAllLights',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a5bc825156f2abd192f79dcbbaea359e7',1,'cv::viz::Viz3d']]], + ['removeallwidgets_349',['removeAllWidgets',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#aab9263b3b70b2f9ac00eec742a835d80',1,'cv::viz::Viz3d']]], + ['removechilds_350',['removeChilds',['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#afeeb32d2ff475a232e7a9f87762284d7',1,'cv::Node']]], + ['removedevicetelemetrycallback_351',['removeDeviceTelemetryCallback',['../namespacecan.html#a8a46628f8f55f509c3d745ba51814c80',1,'can']]], + ['removeduplicated_352',['removeDuplicated',['https://docs.opencv.org/4.2.0/de/db2/classcv_1_1KeyPointsFilter.html#ab037cbf3fd6d9e8d802aab77dc10395b',1,'cv::KeyPointsFilter']]], + ['removeduplicatedsorted_353',['removeDuplicatedSorted',['https://docs.opencv.org/4.2.0/de/db2/classcv_1_1KeyPointsFilter.html#a6f0da858c8fb8f8fab0ffd9a8c9109a5',1,'cv::KeyPointsFilter']]], + ['removeentity_354',['removeEntity',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a29ac46acd9d65da80cb3477a130b5f06',1,'cv::ovis::WindowScene']]], + ['removeevent_355',['removeEvent',['../classutil_1_1PeriodicScheduler.html#ad4ca024dc74ffdcf80fea87e5c17a516',1,'util::PeriodicScheduler']]], + ['removelimitswitchcallback_356',['removeLimitSwitchCallback',['../namespacecan_1_1motor.html#a7afd2bf689a9b364a2fb67216b940597',1,'can::motor']]], + ['removemessagehandler_357',['removeMessageHandler',['../classnet_1_1websocket_1_1WebSocketProtocol.html#a1cc6dd0a89dee979b539ad3afd250500',1,'net::websocket::WebSocketProtocol']]], + ['removenode_358',['removeNode',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a5adcb69ee679da35f74ea3a78594a692',1,'cv::SparseMat']]], + ['removeoutliers_359',['removeOutliers',['https://docs.opencv.org/4.2.0/dc/da7/classcv_1_1TrackerFeatureSet.html#a2492e86e9807cf68900387d5bee62e47',1,'cv::TrackerFeatureSet']]], + ['removewidget_360',['removeWidget',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a5a06f5a8b7bae5a518900afc4634acff',1,'cv::viz::Viz3d']]], + ['removing_20filter_361',['Periodic Noise Removing Filter',['https://docs.opencv.org/4.2.0/d2/d0b/tutorial_periodic_noise_removing_filter.html',1,'']]], + ['rend_362',['rend',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a08cc9cc1c8df58728f94b5533b643073',1,'__gnu_cxx::__versa_string::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aad836eb6a1c101e4a27defcaefb7e5cf',1,'__gnu_cxx::__versa_string::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< _CharT >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< _CharT >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< _CharT, _Traits, _Allocator >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< _CharT, _Traits, _Allocator >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< char >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< char >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< char_type, _Traits, _Alloc >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< char_type, _Traits, _Alloc >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'basic_string< value_type >::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'basic_string< value_type >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0daef1995ab8473dad46086c79ecb9f0',1,'deque< _StateSeqT >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a2d4c0290323b6a5a78b2e30d2706d753',1,'deque< _StateSeqT >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4018c8137dc053cfd04641f1ab4b070e',1,'list< __inp, __rebind_inp >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#af134c3c02479d6b40c4b6dd9784ff9b2',1,'list< __inp, __rebind_inp >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'match_results< _Bi_iter >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'match_results< _Bi_iter >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a320628bf4405d1896c4cbbaa1c0ddee1',1,'std::basic_string::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7bd1be7596d11f5b7e8d7f29372adc61',1,'std::basic_string::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0daef1995ab8473dad46086c79ecb9f0',1,'std::deque::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a2d4c0290323b6a5a78b2e30d2706d753',1,'std::deque::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4018c8137dc053cfd04641f1ab4b070e',1,'std::list::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#af134c3c02479d6b40c4b6dd9784ff9b2',1,'std::list::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#aa467231586b6bc6388765ec6802aef54',1,'std::map::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a21512c1e39cedc32e0275f89f888d4aa',1,'std::map::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'std::match_results::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'std::match_results::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a8852aeaaf83cf8effeacefd97b2c2889',1,'std::multimap::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a47926093ed08fe7fd770c81ef7bbdabd',1,'std::multimap::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a6ffe97a245a1f046e9b536c6d5511ac9',1,'std::multiset::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#afaa0621475cc933cf5a668a4db9fd851',1,'std::set::rend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'std::vector::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'std::vector::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< __diff_type >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< __diff_type >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _CharClassT >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _CharClassT >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _CharT >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _CharT >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _Cmpt >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _Cmpt >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _Node *, _Nodeptr_Alloc >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _Node *, _Nodeptr_Alloc >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _RealType >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _RealType >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _State< _TraitsT::char_type > >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _State< _TraitsT::char_type > >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< _StringT >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< _StringT >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< block_type, allocator_type >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< block_type, allocator_type >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< Catalog_info * >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< Catalog_info * >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< double >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< double >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< int >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< int >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< result_type >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< result_type >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< size_t >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< size_t >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< std::pair< _BiIter, int > >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< std::pair< _BiIter, int > >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< std::pair< _StateIdT, std::vector > >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< std::pair< _StateIdT, std::vector > >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< std::pair< _StrTransT, _StrTransT > >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< std::pair< _StrTransT, _StrTransT > >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< sub_match< _Bi_iter >, _Alloc >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< sub_match< _Bi_iter >, _Alloc >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a52d47db7d19a815e22d1cefdfa94d93c',1,'vector< sub_match< _BiIter >, _Alloc >::rend() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa32a4b05a4c404e012c787360d7518a8',1,'vector< sub_match< _BiIter >, _Alloc >::rend() const noexcept'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'Eigen::VectorwiseOp::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'Eigen::VectorwiseOp::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const Derived, Horizontal >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const Derived, Horizontal >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const Derived, Vertical >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const Derived, Vertical >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::rend() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa9592e93b704f7712e8f33631a2efe8f',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::rend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#afeb3e3ceca37ae0a6e313f80743f767a',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::rend() const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a7a328b29b290cc300345376c54f618cb.html#a7a328b29b290cc300345376c54f618cb',1,'nlohmann::basic_json::rend() noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a2e4cbf41d593d41847b90aea55e5e84d.html#a2e4cbf41d593d41847b90aea55e5e84d',1,'nlohmann::basic_json::rend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac61454493a9b25de6eb36656e6e4213e',1,'std::rend(_Container &__cont) -> decltype(__cont.rend())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8d5191632dac9ebbb502815e5a96db58',1,'std::rend(const _Container &__cont) -> decltype(__cont.rend())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a77a0e2f60fbc43ae0c7ffd07b104558d',1,'std::rend(_Tp(&__arr)[_Nm])'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abf2be64d2e615a35f2357a527dbe4d6a',1,'std::rend(initializer_list< _Tp > __il)']]], + ['render_363',['render',['https://docs.opencv.org/4.2.0/d1/d20/classcv_1_1dynafu_1_1DynaFu.html#afd4ad03177fe105e6f3c1034b0ee944a',1,'cv::dynafu::DynaFu::render()'],['https://docs.opencv.org/4.2.0/d8/d1f/classcv_1_1kinfu_1_1KinFu.html#a5572d4402640210f1bc17e96a9824bea',1,'cv::kinfu::KinFu::render()'],['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a888b6963153283c6d0f22370d8144823',1,'cv::plot::Plot2d::render()'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#gaa315ba452961559eb9222d3ace8ce178',1,'cv::gapi::wip::draw::render(cv::Mat &bgr, const Prims &prims, cv::GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#ga10063407824d197cff1dd7221e9bed1c',1,'cv::gapi::wip::draw::render(cv::Mat &y_plane, cv::Mat &uv_plane, const Prims &prims, cv::GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga64c7a6323ba1b978f2f9142a4bad5ca1',1,'cv::ogl::render(const Texture2D &tex, Rect_< double > wndRect=Rect_< double >(0.0, 0.0, 1.0, 1.0), Rect_< double > texRect=Rect_< double >(0.0, 0.0, 1.0, 1.0))'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga0f86b878c8b65fe081fd4f7ac1e62110',1,'cv::ogl::render(const Arrays &arr, int mode=POINTS, Scalar color=Scalar::all(255))'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga090c1f371c37a575dea8b5c6371aec70',1,'cv::ogl::render(const Arrays &arr, InputArray indices, int mode=POINTS, Scalar color=Scalar::all(255))'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga64c7a6323ba1b978f2f9142a4bad5ca1',1,'render(const Texture2D &tex, Rect_< double > wndRect=Rect_< double >(0.0, 0.0, 1.0, 1.0), Rect_< double > texRect=Rect_< double >(0.0, 0.0, 1.0, 1.0))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga0f86b878c8b65fe081fd4f7ac1e62110',1,'render(const Arrays &arr, int mode=POINTS, Scalar color=Scalar::all(255))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga090c1f371c37a575dea8b5c6371aec70',1,'render(const Arrays &arr, InputArray indices, int mode=POINTS, Scalar color=Scalar::all(255))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#gaa315ba452961559eb9222d3ace8ce178',1,'render(cv::Mat &bgr, const Prims &prims, cv::GCompileArgs &&args={})(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#ga10063407824d197cff1dd7221e9bed1c',1,'render(cv::Mat &y_plane, cv::Mat &uv_plane, const Prims &prims, cv::GCompileArgs &&args={})(Global Namespace)']]], + ['render_2ehpp_364',['render.hpp',['https://docs.opencv.org/4.2.0/d1/dda/render_2render_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d4b/render_8hpp.html',1,'(Global Namespace)']]], + ['render3ch_365',['render3ch',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#gaa5b5b1b06d1e5653a96c692447a026c1',1,'cv::gapi::wip::draw::render3ch()'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#gaa5b5b1b06d1e5653a96c692447a026c1',1,'render3ch(const GMat &src, const GArray< Prim > &prims)(Global Namespace)']]], + ['rendering_366',['Non-Photorealistic Rendering',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html',1,'']]], + ['renderingproperties_367',['RenderingProperties',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gae4df8152c2d8639b915eccd0bb90f8ac',1,'cv::viz::RenderingProperties'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gae4df8152c2d8639b915eccd0bb90f8ac',1,'RenderingProperties(Global Namespace)']]], + ['rendermodes_368',['RenderModes',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#gaf53526c205a92260f356fe6589460aab',1,'cv::ogl::RenderModes'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#gaf53526c205a92260f356fe6589460aab',1,'RenderModes(Global Namespace)']]], + ['rendernv12_369',['renderNV12',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#ga35872fecb834a374ae66c36707dfc0b7',1,'cv::gapi::wip::draw::renderNV12()'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html#ga35872fecb834a374ae66c36707dfc0b7',1,'renderNV12()(Global Namespace)']]], + ['rendersurface_370',['renderSurface',['https://docs.opencv.org/4.2.0/d1/d20/classcv_1_1dynafu_1_1DynaFu.html#a75ad62e354a745785a5133bad5b766de',1,'cv::dynafu::DynaFu']]], + ['reorglayer_371',['ReorgLayer',['https://docs.opencv.org/4.2.0/d6/da3/classcv_1_1dnn_1_1ReorgLayer.html',1,'cv::dnn']]], + ['repeat_372',['repeat',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga496c3860f3ac44c40b48811333cfda2d',1,'cv::repeat(InputArray src, int ny, int nx, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8e9c4ef56a85c58332c63997c10a51d8',1,'cv::repeat(const Mat &src, int ny, int nx)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga496c3860f3ac44c40b48811333cfda2d',1,'repeat(InputArray src, int ny, int nx, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8e9c4ef56a85c58332c63997c10a51d8',1,'repeat(const Mat &src, int ny, int nx)(Global Namespace)']]], + ['replace_373',['replace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab198c2154e2446b3800221546fa5c49a',1,'__gnu_cxx::__versa_string::replace(size_type __pos, size_type __n, const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2baedb7b7e66fa32852e1e5f7b03f839',1,'__gnu_cxx::__versa_string::replace(size_type __pos1, size_type __n1, const __versa_string &__str, size_type __pos2, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a3c9f1deec90a0bc60fd256a104da92ce',1,'__gnu_cxx::__versa_string::replace(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae54741e836d397dd56e21e5e62d1ccbf',1,'__gnu_cxx::__versa_string::replace(size_type __pos, size_type __n1, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#acc1eff3a64f7840cbef6f6fe3b5429f5',1,'__gnu_cxx::__versa_string::replace(size_type __pos, size_type __n1, size_type __n2, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2c79e5c619c0d549e5f014fc5e28b9a3',1,'__gnu_cxx::__versa_string::replace(const_iterator __i1, const_iterator __i2, const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a4a87e0419fea6c1548e867619a8544e4',1,'__gnu_cxx::__versa_string::replace(const_iterator __i1, const_iterator __i2, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aacd71b513fe378c6e44f7a85a9d9335b',1,'__gnu_cxx::__versa_string::replace(const_iterator __i1, const_iterator __i2, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#af5b9f5d9b9d4e6d8d3acedc2d9f8b113',1,'__gnu_cxx::__versa_string::replace(const_iterator __i1, const_iterator __i2, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a98e9ff42df6157eed9db5bfd9a7604ed',1,'__gnu_cxx::__versa_string::replace(const_iterator __i1, const_iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9ade44d5751cd139715d603036d24683',1,'__gnu_cxx::__versa_string::replace(const_iterator __i1, const_iterator __i2, std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'__gnu_debug::basic_string::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'__gnu_debug::basic_string::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'__gnu_debug::basic_string::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'__gnu_debug::basic_string::replace(iterator __i1, iterator __i2, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'__gnu_debug::basic_string::replace(iterator __i1, iterator __i2, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'__gnu_debug::basic_string::replace(iterator __i1, iterator __i2, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'__gnu_debug::basic_string::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'__gnu_debug::basic_string::replace(iterator __i1, iterator __i2, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< _CharT >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< _CharT >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< _CharT >::replace(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< _CharT >::replace(size_type __pos, size_type __n1, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< _CharT >::replace(size_type __pos, size_type __n1, size_type __n2, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< _CharT >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< _CharT >::replace(iterator __i1, iterator __i2, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< _CharT >::replace(iterator __i1, iterator __i2, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< _CharT >::replace(iterator __i1, iterator __i2, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< _CharT >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< _CharT >::replace(iterator __i1, iterator __i2, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< _CharT, _Traits, _Allocator >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< _CharT, _Traits, _Allocator >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< _CharT, _Traits, _Allocator >::replace(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< _CharT, _Traits, _Allocator >::replace(size_type __pos, size_type __n1, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< _CharT, _Traits, _Allocator >::replace(size_type __pos, size_type __n1, size_type __n2, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< _CharT, _Traits, _Allocator >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< _CharT, _Traits, _Allocator >::replace(iterator __i1, iterator __i2, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< _CharT, _Traits, _Allocator >::replace(iterator __i1, iterator __i2, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< _CharT, _Traits, _Allocator >::replace(iterator __i1, iterator __i2, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< _CharT, _Traits, _Allocator >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< _CharT, _Traits, _Allocator >::replace(iterator __i1, iterator __i2, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(size_type __pos, size_type __n1, const _Elem *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(size_type __pos, size_type __n1, const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(size_type __pos, size_type __n1, size_type __n2, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(iterator __i1, iterator __i2, const _Elem *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(iterator __i1, iterator __i2, const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(iterator __i1, iterator __i2, size_type __n, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::replace(iterator __i1, iterator __i2, initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< char >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< char >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< char >::replace(size_type __pos, size_type __n1, const char *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< char >::replace(size_type __pos, size_type __n1, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< char >::replace(size_type __pos, size_type __n1, size_type __n2, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< char >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< char >::replace(iterator __i1, iterator __i2, const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< char >::replace(iterator __i1, iterator __i2, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< char >::replace(iterator __i1, iterator __i2, size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< char >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< char >::replace(iterator __i1, iterator __i2, initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(size_type __pos, size_type __n1, const char *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(size_type __pos, size_type __n1, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(size_type __pos, size_type __n1, size_type __n2, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(iterator __i1, iterator __i2, const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(iterator __i1, iterator __i2, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(iterator __i1, iterator __i2, size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< char, char_traits< char >, _Byte_alloc >::replace(iterator __i1, iterator __i2, initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< char_type, _Traits, _Alloc >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< char_type, _Traits, _Alloc >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< char_type, _Traits, _Alloc >::replace(size_type __pos, size_type __n1, const char_type *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< char_type, _Traits, _Alloc >::replace(size_type __pos, size_type __n1, const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< char_type, _Traits, _Alloc >::replace(size_type __pos, size_type __n1, size_type __n2, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< char_type, _Traits, _Alloc >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< char_type, _Traits, _Alloc >::replace(iterator __i1, iterator __i2, const char_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< char_type, _Traits, _Alloc >::replace(iterator __i1, iterator __i2, const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< char_type, _Traits, _Alloc >::replace(iterator __i1, iterator __i2, size_type __n, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< char_type, _Traits, _Alloc >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< char_type, _Traits, _Alloc >::replace(iterator __i1, iterator __i2, initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'basic_string< value_type >::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'basic_string< value_type >::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'basic_string< value_type >::replace(size_type __pos, size_type __n1, const value_type *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'basic_string< value_type >::replace(size_type __pos, size_type __n1, const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'basic_string< value_type >::replace(size_type __pos, size_type __n1, size_type __n2, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'basic_string< value_type >::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'basic_string< value_type >::replace(iterator __i1, iterator __i2, const value_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'basic_string< value_type >::replace(iterator __i1, iterator __i2, const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'basic_string< value_type >::replace(iterator __i1, iterator __i2, size_type __n, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'basic_string< value_type >::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'basic_string< value_type >::replace(iterator __i1, iterator __i2, initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a499572a795055fb2b4640aa8fa933a7d',1,'std::basic_string::replace(size_type __pos, size_type __n, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae606af4ea116bf6decc1c67e3d35d92b',1,'std::basic_string::replace(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a51945801c8054e522d106ead6dbb2f5d',1,'std::basic_string::replace(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3db009664c81360b5ca3f0d1bfcfdb85',1,'std::basic_string::replace(size_type __pos, size_type __n1, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d0a0149f031ac66fe91076e2e777bac',1,'std::basic_string::replace(size_type __pos, size_type __n1, size_type __n2, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad19978649741d77947601dd6d9060790',1,'std::basic_string::replace(iterator __i1, iterator __i2, const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7445d4650ad19f82110fc756829a3f5f',1,'std::basic_string::replace(iterator __i1, iterator __i2, const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0d1b1f02005d10780da0025d702188ef',1,'std::basic_string::replace(iterator __i1, iterator __i2, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e2e22f1f92a2344a7b08773a7d1eb5e',1,'std::basic_string::replace(iterator __i1, iterator __i2, size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab14ece76be0afccddda61836f3683ba4',1,'std::basic_string::replace(iterator __i1, iterator __i2, _InputIterator __k1, _InputIterator __k2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5c6756c900299cb0b024dae3bb036285',1,'std::basic_string::replace(iterator __i1, iterator __i2, initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga77aa7f436223611f545f84715a30ffeb',1,'std::replace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga77aa7f436223611f545f84715a30ffeb',1,'replace()(Global Namespace)']]], + ['replace_5fcopy_374',['replace_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a306bbe037bd6196bbe5e9c78b1108d13',1,'std']]], + ['replace_5fcopy_5fif_375',['replace_copy_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaf42cb56a0d7dfd9124bddc4194cb53a4',1,'std::replace_copy_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaf42cb56a0d7dfd9124bddc4194cb53a4',1,'replace_copy_if()(Global Namespace)']]], + ['replace_5fif_376',['replace_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga0afa1177a761d23ec3ec965207144455',1,'std::replace_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga0afa1177a761d23ec3ec965207144455',1,'replace_if()(Global Namespace)']]], + ['replace_5fminimal_5fn_377',['replace_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a524589fca5b42e749dd5d5c2561fdacd',1,'__gnu_parallel::_Settings']]], + ['replaceclassifierstatistic_378',['replaceClassifierStatistic',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html#a9ed60a99317d6044cbca77a6ef9ee2ec',1,'cv::BaseClassifier']]], + ['replaceweakclassifier_379',['replaceWeakClassifier',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html#a31742fc5d120c07cba942c1baf4d2529',1,'cv::BaseClassifier::replaceWeakClassifier()'],['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html#ab518bccdfb6abb4c85319f67829b55c5',1,'cv::StrongClassifierDirectSelection::replaceWeakClassifier()']]], + ['replicate_380',['Replicate',['https://eigen.tuxfamily.org/dox/classEigen_1_1Replicate.html',1,'Eigen']]], + ['replicate_381',['replicate',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a60dadfe80b813d808e91e4521c722a8e',1,'Eigen::DenseBase::replicate() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#afae2d5e36f1158d1b1681dac3cdbd58e',1,'Eigen::DenseBase::replicate(Index rowFactor, Index colFactor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a60dadfe80b813d808e91e4521c722a8e',1,'DenseBase< ArrayWrapper< ExpressionType > >::replicate() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#afae2d5e36f1158d1b1681dac3cdbd58e',1,'DenseBase< ArrayWrapper< ExpressionType > >::replicate(Index rowFactor, Index colFactor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a60dadfe80b813d808e91e4521c722a8e',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::replicate() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#afae2d5e36f1158d1b1681dac3cdbd58e',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::replicate(Index rowFactor, Index colFactor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a60dadfe80b813d808e91e4521c722a8e',1,'DenseBase< Solve< Decomposition, RhsType > >::replicate() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#afae2d5e36f1158d1b1681dac3cdbd58e',1,'DenseBase< Solve< Decomposition, RhsType > >::replicate(Index rowFactor, Index colFactor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'Eigen::VectorwiseOp::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'Eigen::VectorwiseOp::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const Derived, Horizontal >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const Derived, Horizontal >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const Derived, Vertical >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const Derived, Vertical >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::replicate(Index factor=Factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5f0c8dc9e9c4aeaa2057f15800f5c18c',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::replicate(Index factor) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a81bfb88fe6415c7bfd9bdf15ef608aaa',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::replicate(Index factor=Factor) const']]], + ['representation_382',['REPRESENTATION',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca36a301be1668d029901f94cd3226d802',1,'cv::viz::REPRESENTATION'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca36a301be1668d029901f94cd3226d802',1,'REPRESENTATION(Global Namespace)']]], + ['representation_5fpoints_383',['REPRESENTATION_POINTS',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gga4b33d8c74317eb777b20accb8fe2ce4caa96f1fac6585f2154df245cd9be07e78',1,'cv::viz::REPRESENTATION_POINTS'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gga4b33d8c74317eb777b20accb8fe2ce4caa96f1fac6585f2154df245cd9be07e78',1,'REPRESENTATION_POINTS(Global Namespace)']]], + ['representation_5fsurface_384',['REPRESENTATION_SURFACE',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gga4b33d8c74317eb777b20accb8fe2ce4ca5d5672bade6a20e704b087cb19c5009a',1,'cv::viz::REPRESENTATION_SURFACE'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gga4b33d8c74317eb777b20accb8fe2ce4ca5d5672bade6a20e704b087cb19c5009a',1,'REPRESENTATION_SURFACE(Global Namespace)']]], + ['representation_5fwireframe_385',['REPRESENTATION_WIREFRAME',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gga4b33d8c74317eb777b20accb8fe2ce4cad9e6a89e8d3a8e2c7d4d0af09047e07d',1,'cv::viz::REPRESENTATION_WIREFRAME'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gga4b33d8c74317eb777b20accb8fe2ce4cad9e6a89e8d3a8e2c7d4d0af09047e07d',1,'REPRESENTATION_WIREFRAME(Global Namespace)']]], + ['representationvalues_386',['RepresentationValues',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ga4b33d8c74317eb777b20accb8fe2ce4c',1,'cv::viz::RepresentationValues'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ga4b33d8c74317eb777b20accb8fe2ce4c',1,'RepresentationValues(Global Namespace)']]], + ['reproject_387',['reproject',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1face_1_1FacemarkLBF_1_1BBox.html#a16c8be68bb61d6c3d48d0addbf2ac2fe',1,'cv::face::FacemarkLBF::BBox']]], + ['reprojectimageto3d_388',['reprojectImageTo3D',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga1bc1152bd57d63bc524204f21fde6e02',1,'cv::reprojectImageTo3D()'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#gaff851e3932da0f3e74d1be1d8855f094',1,'cv::cuda::reprojectImageTo3D()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga1bc1152bd57d63bc524204f21fde6e02',1,'reprojectImageTo3D(InputArray disparity, OutputArray _3dImage, InputArray Q, bool handleMissingValues=false, int ddepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#gaff851e3932da0f3e74d1be1d8855f094',1,'reprojectImageTo3D(InputArray disp, OutputArray xyzw, InputArray Q, int dst_cn=4, Stream &stream=Stream::Null())(Global Namespace)']]], + ['requested_5fsize_389',['requested_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a6cc6bd1d6df0b852168f5065c01433ca',1,'__gnu_cxx::temporary_buffer::requested_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a6cc6bd1d6df0b852168f5065c01433ca',1,'std::_Temporary_buffer::requested_size()']]], + ['require_5finput_5fiter_390',['require_input_iter',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a89cc338e8466e74baaa138664c79ee98.html#a89cc338e8466e74baaa138664c79ee98',1,'nlohmann::ordered_map']]], + ['rescaledepth_391',['rescaleDepth',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gad02260251f8486bba19f126139c12e3b',1,'cv::rgbd::rescaleDepth()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gad02260251f8486bba19f126139c12e3b',1,'rescaleDepth()(Global Namespace)']]], + ['reserve_392',['reserve',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a0706ed6c42e288926c5ad415b976bbe2',1,'cv::Mat::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aec0611cbd406403c883086089c95a512',1,'__gnu_cxx::__versa_string::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'__gnu_debug::basic_string::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< _CharT >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< _CharT, _Traits, _Allocator >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< char >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< char, char_traits< char >, _Byte_alloc >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< char_type, _Traits, _Alloc >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'basic_string< value_type >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'match_results< _Bi_iter >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a33d4d3491641d9129f660cb46a9ccac8',1,'std::basic_string::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'std::match_results::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2eee23bd13796426f3018c8a9341202f',1,'std::unordered_map::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a9167538c4058279e45627d0a68f3d030',1,'std::unordered_multimap::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aad33b09815e29fc00dba2408e91e3ed6',1,'std::unordered_multiset::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#aeb44171c81ee124bbb21a113ff318530',1,'std::unordered_set::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'std::vector::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2eee23bd13796426f3018c8a9341202f',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< __diff_type >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _CharClassT >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _CharT >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _Cmpt >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _Node *, _Nodeptr_Alloc >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _RealType >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _State< _TraitsT::char_type > >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< _StringT >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< block_type, allocator_type >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< Catalog_info * >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< double >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< int >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< result_type >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< size_t >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< std::pair< _BiIter, int > >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< std::pair< _StateIdT, std::vector > >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< std::pair< _StrTransT, _StrTransT > >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< sub_match< _Bi_iter >, _Alloc >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::reserve()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8ab62036345a72d8126fa30425dfe869',1,'vector< sub_match< _BiIter >, _Alloc >::reserve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2b219eb36fbab0bfae535cfbfc74a76',1,'Eigen::SparseMatrix::reserve(const SizesType &reserveSizes)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1518e58ac49bed0e2385b722a034f7d3',1,'Eigen::SparseMatrix::reserve(Index reserveSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2b219eb36fbab0bfae535cfbfc74a76',1,'SparseMatrix< Scalar >::reserve(const SizesType &reserveSizes)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1518e58ac49bed0e2385b722a034f7d3',1,'SparseMatrix< Scalar >::reserve(Index reserveSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2b219eb36fbab0bfae535cfbfc74a76',1,'SparseMatrix< Scalar, ColMajor, int >::reserve(const SizesType &reserveSizes)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1518e58ac49bed0e2385b722a034f7d3',1,'SparseMatrix< Scalar, ColMajor, int >::reserve(Index reserveSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2b219eb36fbab0bfae535cfbfc74a76',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::reserve(const SizesType &reserveSizes)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1518e58ac49bed0e2385b722a034f7d3',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::reserve(Index reserveSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2b219eb36fbab0bfae535cfbfc74a76',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::reserve(const SizesType &reserveSizes)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1518e58ac49bed0e2385b722a034f7d3',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::reserve(Index reserveSize)']]], + ['reservebuffer_393',['reserveBuffer',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a923eead22fe7f0c48aa000158df920f3',1,'cv::Mat']]], + ['reset_394',['reset',['https://docs.opencv.org/4.2.0/d1/d20/classcv_1_1dynafu_1_1DynaFu.html#a1dca408d6eab13eb4449c7feaa10d185',1,'cv::dynafu::DynaFu::reset()'],['https://docs.opencv.org/4.2.0/d4/df3/classcv_1_1Formatted.html#a2519cc8dfbf00321adb105fe3aed5d92',1,'cv::Formatted::reset()'],['https://docs.opencv.org/4.2.0/d4/dd6/classcv_1_1superres_1_1FrameSource.html#a87870160d68199b12b89e827f1af6fc6',1,'cv::superres::FrameSource::reset()'],['https://docs.opencv.org/4.2.0/d1/d81/classcv_1_1videostab_1_1IFrameSource.html#a4aca86a6810f2330f4934db4dce65822',1,'cv::videostab::IFrameSource::reset()'],['https://docs.opencv.org/4.2.0/d8/d1f/classcv_1_1kinfu_1_1KinFu.html#ac784d8e5a9379fbb64ac98278c3e2ca8',1,'cv::kinfu::KinFu::reset()'],['https://docs.opencv.org/4.2.0/da/d26/classcv_1_1videostab_1_1MaskFrameSource.html#af2708078e236b8ac406faca6b8bef50a',1,'cv::videostab::MaskFrameSource::reset()'],['https://docs.opencv.org/4.2.0/dd/d5b/classcv_1_1videostab_1_1NullFrameSource.html#a1d35b1f331c32f929f28e59969d23ba9',1,'cv::videostab::NullFrameSource::reset()'],['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#ad6f34069d0bdd8dab0cb47035a5307d9',1,'cv::videostab::OnePassStabilizer::reset()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a431117c910e3d0bae5757e3cacc65b60',1,'cv::util::optional::reset()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a0a04c12c0db40651f58cec47f091117a',1,'cv::videostab::StabilizerBase::reset()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#abf79128e553d3460d47d1ca0f26f5376',1,'cv::superres::SuperResolution::reset()'],['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html#ac9a8a593b4bd1c4ea6a1076c735260dd',1,'cv::TickMeter::reset()'],['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a2241168940d3b7f2a8496db2ca41da52',1,'cv::videostab::TwoPassStabilizer::reset()'],['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html#a10dd3ec812bac4d93150e1b58d8cbf19',1,'cv::detail::VectorRef::reset()'],['https://docs.opencv.org/4.2.0/d2/dab/classcv_1_1detail_1_1VectorRefT.html#ac305147bc57001546f8d8d1c6131cc1e',1,'cv::detail::VectorRefT::reset()'],['https://docs.opencv.org/4.2.0/da/d0b/classcv_1_1videostab_1_1VideoFileSource.html#a7dae5c70dbb2829643ffb84576c5eb5d',1,'cv::videostab::VideoFileSource::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a305329ded629d15f8ff5f84d642357f9',1,'gamma_distribution< double >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a305329ded629d15f8ff5f84d642357f9',1,'gamma_distribution< result_type >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a757217130ef7b0eb980500afc8bd865c',1,'normal_distribution< double >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a757217130ef7b0eb980500afc8bd865c',1,'normal_distribution< result_type >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a7d9519c9b72d8add8292661b822ab7fe',1,'std::auto_ptr::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#a0e2d60fd13c2709af0294ab028e0646a',1,'std::bernoulli_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#acac7f32aa4a2b3ac2e512c5097aa70dc',1,'std::binomial_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a74ba5bc37dd7a687b8f05883e076f3bd',1,'std::bitset::reset() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#af4c2e2cef691e173dca06e743dce31fa',1,'std::bitset::reset(size_t __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#aa71463201b987ecaf218767aeaf9f8e8',1,'std::cauchy_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a97c1963c5d5cab27292ba7233cb54b5e',1,'std::chi_squared_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a42f8e4f291038ca9a9d1057f58d506d3',1,'std::discrete_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a1d72f5ccd6ee769af3d8cc82ed350e99',1,'std::exponential_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#a31f27dfe6c4727fb924d04ab3450fa14',1,'std::extreme_value_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a1a8ed43ea1042c8a502c4d497cff95a8',1,'std::fisher_f_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a305329ded629d15f8ff5f84d642357f9',1,'std::gamma_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#ad170e9c049fc1d5df02da5097eda29df',1,'std::geometric_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#aad743c49b0d74f10dd9831daf56792a4',1,'std::lognormal_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#afb3d4cc6b63de72f9bbcf9f1f630f1d8',1,'std::negative_binomial_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a757217130ef7b0eb980500afc8bd865c',1,'std::normal_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a4ce6dad62329546bb55d810817c332b2',1,'std::piecewise_constant_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a8fe3e119433b9e32abad358259e295cc',1,'std::piecewise_linear_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a22ecafd7d767621e777f6e8e556ff453',1,'std::poisson_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a48d5f501c9847b3688480efece2a0f8c',1,'std::student_t_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a506b883f52467029cd9245e063730156',1,'std::tr2::dynamic_bitset::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a7882b9f8c437599fc24e0e01e5346af2',1,'std::tr2::dynamic_bitset::reset(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a0a3d8e2f31efa9279eae703aef76632c',1,'std::uniform_int_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#a32de9a167158ce4d66cf0b07296a13c8',1,'std::uniform_real_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0922a8f5a7c082e9495e43a0fab365da',1,'std::unique_ptr::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a4d205b7ff644487394c5bce1cbf6a6ac',1,'std::unique_ptr< _Tp[], _Dp >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a3c2c5842081debd56978c362bdbe9fda',1,'std::weibull_distribution::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0922a8f5a7c082e9495e43a0fab365da',1,'unique_ptr< _Codecvt >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0922a8f5a7c082e9495e43a0fab365da',1,'unique_ptr< _Res_type >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0922a8f5a7c082e9495e43a0fab365da',1,'unique_ptr< _Result< _Res > >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0922a8f5a7c082e9495e43a0fab365da',1,'unique_ptr< _Result_base >::reset()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0922a8f5a7c082e9495e43a0fab365da',1,'unique_ptr< bool[]>::reset()'],['../classcontrol_1_1JacobianPosController.html#a98412d8f0683607aa781d1f6e0617382',1,'control::JacobianPosController::reset()'],['../classJacobianVelController.html#ae7290ed4e0d2188461768ee9242e5c52',1,'JacobianVelController::reset()'],['../classcontrol_1_1PIDController.html#a391a6167a7d5fa3653d42f9f1c55ae1b',1,'control::PIDController::reset()'],['../classcontrol_1_1TrapezoidalVelocityProfile.html#ab46ea8c35445ed8d240368862e454bae',1,'control::TrapezoidalVelocityProfile::reset()'],['../classcontrol_1_1SingleDimTrapezoidalVelocityProfile.html#a4aa38b4e4ade9f91ef100124f41cc412',1,'control::SingleDimTrapezoidalVelocityProfile::reset()'],['../classfilters_1_1KalmanFilterBase.html#ac3e13d231843250d4f7e046c0fc4a8e9',1,'filters::KalmanFilterBase::reset()'],['../classfilters_1_1KalmanFilterBase.html#a7a0b8fc99ca7045a6c463bdba0d50134',1,'filters::KalmanFilterBase::reset(const Eigen::Matrix< double, stateDim, 1 > &state)'],['../classfilters_1_1KalmanFilterBase.html#a2b6c3add0c00eb69d4b9e8b70b4fecf3',1,'filters::KalmanFilterBase::reset(const Eigen::Matrix< double, stateDim, 1 > &state, const Eigen::Matrix< double, stateDim, 1 > &stdDevs)'],['../classfilters_1_1KalmanFilterBase.html#aabc156912cdbd42c559806bc25999196',1,'filters::KalmanFilterBase::reset(const Eigen::Matrix< double, stateDim, 1 > &state, const Eigen::Matrix< double, stateDim, stateDim > &estCovMat)'],['../classfilters_1_1RollingAvgFilter.html#a6f526515c51fff61123214def1a12b2a',1,'filters::RollingAvgFilter::reset()']]], + ['reset_5fscratch_395',['reset_scratch',['https://docs.opencv.org/4.2.0/d4/d77/structcv_1_1detail_1_1FluidCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_16cb3b081e952d44068dce53ded07afdc.html#a314fb3bfc854d9c10d1fdcc67edc2834',1,'cv::detail::FluidCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... >, UseScratch >']]], + ['resetcamera_396',['resetCamera',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a836d8684b8bd36aea09706fff4d6c0d6',1,'cv::viz::Viz3d']]], + ['resetcameraviewpoint_397',['resetCameraViewpoint',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a4c98ec028511f60527959afafb73c75c',1,'cv::viz::Viz3d']]], + ['resetcolorarray_398',['resetColorArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a312b67d3fea28ee6fdcfbf2184bfee1b',1,'cv::ogl::Arrays']]], + ['resetdevice_399',['resetDevice',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga6153b6f461101374e655a54fc77e725e',1,'cv::cuda::resetDevice()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga6153b6f461101374e655a54fc77e725e',1,'resetDevice()(Global Namespace)']]], + ['resetiosflags_400',['resetiosflags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a12ef9b47a80c8f0606aa34dab5477524',1,'std']]], + ['resetmyriaddevice_401',['resetMyriadDevice',['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a845954e233d408c56911db34bf8a800c',1,'cv::dnn']]], + ['resetnormalarray_402',['resetNormalArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a26cd068ff065960cd3fc7d99bcf005b7',1,'cv::ogl::Arrays']]], + ['resetpeakusage_403',['resetPeakUsage',['https://docs.opencv.org/4.2.0/df/d6f/classcv_1_1utils_1_1AllocatorStatisticsInterface.html#a224175e57f5cd7814e8fcdca2b76e496',1,'cv::utils::AllocatorStatisticsInterface']]], + ['resettexcoordarray_404',['resetTexCoordArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a30cbc94c7a8e9c4dbbe0ad2699a51638',1,'cv::ogl::Arrays']]], + ['resettrace_405',['resetTrace',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a2bfb5e5c8e5f5d81aa19dfe8b168863e',1,'cv::instr']]], + ['resettracking_406',['resetTracking',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ac5069e92d25b70eb15ca31d856f70ef8',1,'cv::DetectionBasedTracker']]], + ['resetvertexarray_407',['resetVertexArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a3bae2d1d0a047f4f2b14fb229ccba87c',1,'cv::ogl::Arrays']]], + ['reshape_408',['Reshape',['https://eigen.tuxfamily.org/dox/group__TutorialReshape.html',1,'']]], + ['reshape_409',['reshape',['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ae51d8dbce56c9804e6eb9440c811ba44',1,'cv::GCompiled::reshape()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a408e22ed824d1ddf59f58bda895017a8',1,'cv::cuda::GpuMat::reshape()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a31e3165f8fc1a4863d7a67a973f5bd68',1,'cv::cuda::HostMem::reshape()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a4eb96e3251417fa88b78e2abd6cfd7d8',1,'cv::Mat::reshape(int cn, int rows=0) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a50e606fe51f53b896b66051634a018fb',1,'cv::Mat::reshape(int cn, int newndims, const int *newsz) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ab2e41a510891e548f744832cf9b8ab89',1,'cv::Mat::reshape(int cn, const std::vector< int > &newshape) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'cv::Matx::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< _Tp, cn, 1 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, 1, 3 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, 2, 2 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, 2, 3 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, 3, 3 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, 3, 4 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, 4, 4 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< double, cn, 1 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< float, 2, 3 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< float, 3, 3 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< float, cn, 1 >::reshape()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a38e9d03a3e0a555a8b763ad2bf0383fe',1,'Matx< float_type, 4, 4 >::reshape()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a25ac687266568c8b024debd187c15b9b',1,'cv::UMat::reshape(int cn, int rows=0) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ac166eaa6eccbeb2f5e9ce593ee156ef4',1,'cv::UMat::reshape(int cn, int newndims, const int *newsz) const']]], + ['reshape_5f_410',['reshape_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8d3afd333e85d069621e002238050d9',1,'cv::cudev::reshape_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8d3afd333e85d069621e002238050d9',1,'reshape_()(Global Namespace)']]], + ['reshaped_411',['Reshaped',['https://eigen.tuxfamily.org/dox/classEigen_1_1Reshaped.html',1,'Eigen::Reshaped< class, Rows, Cols, Order >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Reshaped.html#a6de25b03b93cb3dc55ba7fcafae87984',1,'Eigen::Reshaped::Reshaped(XprType &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Reshaped.html#a26f25c9bc61d72ae9db5d62112d4a26a',1,'Eigen::Reshaped::Reshaped(XprType &xpr, Index reshapeRows, Index reshapeCols)']]], + ['reshapelayer_412',['ReshapeLayer',['https://docs.opencv.org/4.2.0/db/d15/classcv_1_1dnn_1_1ReshapeLayer.html',1,'cv::dnn']]], + ['residual_413',['residual',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#ae1447eb1b9f10cfadadd2b1f2ec4f2c2',1,'cv::ppf_match_3d::Pose3D']]], + ['resimheight_414',['resImHeight',['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#a46088d05127021270b1c50849b7cda92',1,'cv::saliency::StaticSaliencySpectralResidual']]], + ['resimwidth_415',['resImWidth',['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#acfea65febba2693babafb11a63150f42',1,'cv::saliency::StaticSaliencySpectralResidual']]], + ['resize_416',['resize',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#ae8e150ecf6dbac7605fd7e8ad4cc7d01',1,'cv::TrackerKCF::Params::resize'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a97edc51af209cd6ab20da864c3468124',1,'cv::AutoBuffer::resize()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a97edc51af209cd6ab20da864c3468124',1,'AutoBuffer< double, 1 >::resize()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a97edc51af209cd6ab20da864c3468124',1,'AutoBuffer< int64, 1 >::resize()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a97edc51af209cd6ab20da864c3468124',1,'AutoBuffer< String, 1 >::resize()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ad0127b138acfcc2dcd5dafc51175b309',1,'cv::Mat::resize(size_t sz)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#abdbf4852beb3af95977fa289f6c7034c',1,'cv::Mat::resize(size_t sz, const Scalar &s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a71062fb582528519cd66bbe96a89be13',1,'__gnu_cxx::__versa_string::resize(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aab92cb1d9ba7c14d17cbf4a6a6578bbd',1,'__gnu_cxx::__versa_string::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11175.html#aa602ba7bfa4925ea84591734c68d49e2',1,'__gnu_pbds::hash_standard_resize_policy::resize()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< _CharT >::resize(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< _CharT >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< _CharT, _Traits, _Allocator >::resize(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< _CharT, _Traits, _Allocator >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::resize(size_type __n, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< char >::resize(size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< char >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< char, char_traits< char >, _Byte_alloc >::resize(size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< char, char_traits< char >, _Byte_alloc >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< char_type, _Traits, _Alloc >::resize(size_type __n, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< char_type, _Traits, _Alloc >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'basic_string< value_type >::resize(size_type __n, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'basic_string< value_type >::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a2cb09fae5538690a6175b6e738f39b59',1,'deque< _StateSeqT >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5f7f1a01f2d6a06b4c89a4c5a84a9002',1,'deque< _StateSeqT >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a06a57b2ab785e15264e7f36742c4b0dc',1,'list< __inp, __rebind_inp >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a235d2bb37c9a5d9323c123ebd060cebc',1,'list< __inp, __rebind_inp >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'match_results< _Bi_iter >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'match_results< _Bi_iter >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7530f355537da638911c78ef7925daa9',1,'std::basic_string::resize(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9c65ed069cb3a757975febfef57479cd',1,'std::basic_string::resize(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a2cb09fae5538690a6175b6e738f39b59',1,'std::deque::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5f7f1a01f2d6a06b4c89a4c5a84a9002',1,'std::deque::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a73ffca07b591237200b852caf7040057',1,'std::forward_list::resize(size_type __sz)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#abfb248e17d0392a8caf5c46683102332',1,'std::forward_list::resize(size_type __sz, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a06a57b2ab785e15264e7f36742c4b0dc',1,'std::list::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a235d2bb37c9a5d9323c123ebd060cebc',1,'std::list::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'std::match_results::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'std::match_results::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a3e0c1dfb374af7a457d5e74d04b37b95',1,'std::tr2::dynamic_bitset::resize()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f9fdb05edd4a7364dec8a5e9ae2a0bb',1,'std::valarray::resize()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'std::vector::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'std::vector::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f9fdb05edd4a7364dec8a5e9ae2a0bb',1,'valarray< size_t >::resize()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< __diff_type >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< __diff_type >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _CharClassT >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _CharClassT >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _CharT >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _CharT >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _Cmpt >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _Cmpt >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _Node *, _Nodeptr_Alloc >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _Node *, _Nodeptr_Alloc >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _RealType >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _RealType >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _State< _TraitsT::char_type > >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _State< _TraitsT::char_type > >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< _StringT >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< _StringT >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< block_type, allocator_type >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< block_type, allocator_type >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< Catalog_info * >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< Catalog_info * >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< double >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< double >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< int >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< int >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< result_type >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< result_type >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< size_t >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< size_t >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< std::pair< _BiIter, int > >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< std::pair< _BiIter, int > >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< std::pair< _StateIdT, std::vector > >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< std::pair< _StateIdT, std::vector > >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< std::pair< _StrTransT, _StrTransT > >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< std::pair< _StrTransT, _StrTransT > >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< sub_match< _Bi_iter >, _Alloc >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< sub_match< _Bi_iter >, _Alloc >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::resize(size_type __new_size, const value_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1134bcc83ff6c70cf78bab3cd426feaf',1,'vector< sub_match< _BiIter >, _Alloc >::resize(size_type __new_size)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a53e627a12d33d2df15d4a9c25c872785',1,'vector< sub_match< _BiIter >, _Alloc >::resize(size_type __new_size, const value_type &__x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayWrapper.html#a1dff702690e4d5795b3d08c5c6c1d082',1,'Eigen::ArrayWrapper::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayWrapper.html#a1c5e643b7dc161066754e0812d57c4f1',1,'Eigen::ArrayWrapper::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2ec5bac4e1ab95808808ef50ccf4cb39',1,'Eigen::DenseBase::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a25e2b4887b47b1f2346857d1931efa0f',1,'Eigen::DenseBase::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2ec5bac4e1ab95808808ef50ccf4cb39',1,'DenseBase< ArrayWrapper< ExpressionType > >::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a25e2b4887b47b1f2346857d1931efa0f',1,'DenseBase< ArrayWrapper< ExpressionType > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2ec5bac4e1ab95808808ef50ccf4cb39',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a25e2b4887b47b1f2346857d1931efa0f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2ec5bac4e1ab95808808ef50ccf4cb39',1,'DenseBase< Solve< Decomposition, RhsType > >::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a25e2b4887b47b1f2346857d1931efa0f',1,'DenseBase< Solve< Decomposition, RhsType > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#af04e2fd5733eda42f0d82bb6b7405b42',1,'Eigen::DiagonalMatrix::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixWrapper.html#a1712f7e4840af7950ff480aa2efe1b8f',1,'Eigen::MatrixWrapper::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixWrapper.html#a41d991d9d3e380c88c2d7f1051c8d3f4',1,'Eigen::MatrixWrapper::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a0e0fda6e84d69e02432e4770359bb532',1,'Eigen::PermutationBase::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a0e0fda6e84d69e02432e4770359bb532',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a0e0fda6e84d69e02432e4770359bb532',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a0e0fda6e84d69e02432e4770359bb532',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a0e0fda6e84d69e02432e4770359bb532',1,'PermutationBase< PermutationWrapper< _IndicesType > >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'Eigen::PlainObjectBase::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'Eigen::PlainObjectBase::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'Eigen::PlainObjectBase::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'Eigen::PlainObjectBase::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a9fd0703bd7bfe89d6dc80e2ce87c312a',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae4bbe4c06c1feb1035573eee7f5c3623',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8bee1e51417bfa386dd54b37f6d9e2fe',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a0dd078df3ff8b3833723ce84ce519651',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af88551f30202341b7cc24cfadabdec5c',1,'Eigen::SparseMatrix::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af88551f30202341b7cc24cfadabdec5c',1,'SparseMatrix< Scalar >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af88551f30202341b7cc24cfadabdec5c',1,'SparseMatrix< Scalar, ColMajor, int >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af88551f30202341b7cc24cfadabdec5c',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af88551f30202341b7cc24cfadabdec5c',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::resize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#a9b42c595fd4df10700260dc71887ecd2',1,'Eigen::SparseVector::resize(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#a2ea1091874a71c8511be8a21bf238f5a',1,'Eigen::SparseVector::resize(Index rows, Index cols)'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga47a974309e9102f5f08231edc7e7529d',1,'cv::resize()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga4f5fa0770d1c9efbadb9be1b92a6452a',1,'cv::cuda::resize()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gad0ae87ad8b909c3c11a07b007837be8b',1,'cv::gapi::resize()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga2fe39d2201b12e1b961ca56b2aff9ff2',1,'cv::hal::resize()'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga47a974309e9102f5f08231edc7e7529d',1,'resize(InputArray src, OutputArray dst, Size dsize, double fx=0, double fy=0, int interpolation=INTER_LINEAR)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga2fe39d2201b12e1b961ca56b2aff9ff2',1,'resize(int src_type, const uchar *src_data, size_t src_step, int src_width, int src_height, uchar *dst_data, size_t dst_step, int dst_width, int dst_height, double inv_scale_x, double inv_scale_y, int interpolation)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gad0ae87ad8b909c3c11a07b007837be8b',1,'resize(const GMat &src, const Size &dsize, double fx=0, double fy=0, int interpolation=INTER_LINEAR)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga4f5fa0770d1c9efbadb9be1b92a6452a',1,'resize(InputArray src, OutputArray dst, Size dsize, double fx=0, double fy=0, int interpolation=INTER_LINEAR, Stream &stream=Stream::Null())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f9fdb05edd4a7364dec8a5e9ae2a0bb',1,'resize(size_t __size, _Tp __c=_Tp())(Global Namespace)']]], + ['resize_2ehpp_417',['resize.hpp',['https://docs.opencv.org/4.2.0/dc/d12/resize_8hpp.html',1,'']]], + ['resize_5f_418',['resize_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7ec59e3064d1cc11501c386d7541abe',1,'cv::cudev::resize_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7ec59e3064d1cc11501c386d7541abe',1,'resize_()(Global Namespace)']]], + ['resize_5ferror_419',['resize_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11139.html',1,'__gnu_pbds']]], + ['resize_5fpolicy_420',['resize_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11611.html',1,'__gnu_pbds::detail']]], + ['resize_5fpolicy_2ehpp_421',['resize_policy.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01202.html',1,'']]], + ['resize_5fpolicy_3c_20_5falloc_3a_3asize_5ftype_20_3e_422',['resize_policy< _Alloc::size_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11611.html',1,'']]], + ['resizedimagedescriptor_423',['ResizedImageDescriptor',['https://docs.opencv.org/4.2.0/d5/d34/classcv_1_1tbm_1_1ResizedImageDescriptor.html',1,'cv::tbm::ResizedImageDescriptor'],['https://docs.opencv.org/4.2.0/d5/d34/classcv_1_1tbm_1_1ResizedImageDescriptor.html#a3da940195bffb9bb396400e140b44844',1,'cv::tbm::ResizedImageDescriptor::ResizedImageDescriptor()']]], + ['resizehashtab_424',['resizeHashTab',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af86523883daef3f618a7ec38fe049edc',1,'cv::SparseMat']]], + ['resizelayer_425',['ResizeLayer',['https://docs.opencv.org/4.2.0/db/d38/classcv_1_1dnn_1_1ResizeLayer.html',1,'cv::dnn']]], + ['resizelike_426',['resizeLike',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'Eigen::PlainObjectBase::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aabf64c98e5415ad39828a83cc5bdac40',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::resizeLike()']]], + ['resizep_427',['resizeP',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga3e57b0f6b2c54564502ff87231c24782',1,'cv::gapi::resizeP()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga3e57b0f6b2c54564502ff87231c24782',1,'resizeP()(Global Namespace)']]], + ['resizeptr_428',['ResizePtr',['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html',1,'cv::cudev']]], + ['resizeptr_429',['resizePtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga344c228aa97d18d8a06ec576b65d652e',1,'cv::cudev::resizePtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga344c228aa97d18d8a06ec576b65d652e',1,'resizePtr()(Global Namespace)']]], + ['resizeptrsz_430',['ResizePtrSz',['https://docs.opencv.org/4.2.0/d3/d8a/structcv_1_1cudev_1_1ResizePtrSz.html',1,'cv::cudev']]], + ['resizewindow_431',['resizeWindow',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga9e80e080f7ef33f897e415358aee7f7e',1,'cv::resizeWindow(const String &winname, int width, int height)'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gab4e70200bf54be967129cf08ac5e18bc',1,'cv::resizeWindow(const String &winname, const cv::Size &size)'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga9e80e080f7ef33f897e415358aee7f7e',1,'resizeWindow(const String &winname, int width, int height)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gab4e70200bf54be967129cf08ac5e18bc',1,'resizeWindow(const String &winname, const cv::Size &size)(Global Namespace)']]], + ['resizing_432',['Resizing',['https://eigen.tuxfamily.org/dox/TopicResizing.html',1,'']]], + ['resolution_433',['Resolution',['https://docs.opencv.org/4.2.0/d1/d5b/group__datasets__sr.html',1,'Super Resolution'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html',1,'Super Resolution']]], + ['resolution_434',['resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'DNN used for super resolution'],['https://docs.opencv.org/4.2.0/db/d26/structcv_1_1face_1_1FacemarkAAM_1_1Model_1_1Texture.html#a28fddd3b26132d4a86b29def5002beda',1,'cv::face::FacemarkAAM::Model::Texture::resolution']]], + ['resolution_20benchmarking_435',['Super-resolution benchmarking',['https://docs.opencv.org/4.2.0/dc/d69/tutorial_dnn_superres_benchmark.html',1,'']]], + ['resolution_20using_20cnns_436',['Super Resolution using CNNs',['https://docs.opencv.org/4.2.0/d8/df8/tutorial_table_of_content_dnn_superres.html',1,'']]], + ['response_437',['response',['https://docs.opencv.org/4.2.0/d9/daa/structcvhalKeyPoint.html#aafc45286e9e117335903c1cb0d6eb5b7',1,'cvhalKeyPoint::response'],['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a6cd22aa3cdcf0613f457d4881b51f7ad',1,'cv::line_descriptor::KeyLine::response'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#a1f163ac418c281042e28895b20514360',1,'cv::KeyPoint::response']]], + ['response_5frow_438',['RESPONSE_ROW',['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#a810ecff1a31927ff24743ba3c4d32cfc',1,'cv::cuda::FastFeatureDetector::RESPONSE_ROW'],['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#a04b6911c96f9416581d449a7413b5d67',1,'cv::cuda::ORB::RESPONSE_ROW']]], + ['restoreimagefromlaplacepyr_439',['restoreImageFromLaplacePyr',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga534299b90685590682e84ca30d40527e',1,'cv::detail::restoreImageFromLaplacePyr()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga534299b90685590682e84ca30d40527e',1,'restoreImageFromLaplacePyr()(Global Namespace)']]], + ['restoreimagefromlaplacepyrgpu_440',['restoreImageFromLaplacePyrGpu',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga30165ec358a75d9476e16138967ed121',1,'cv::detail::restoreImageFromLaplacePyrGpu()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga30165ec358a75d9476e16138967ed121',1,'restoreImageFromLaplacePyrGpu()(Global Namespace)']]], + ['result_441',['Result',['https://docs.opencv.org/4.2.0/dc/de8/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a699ef8c594d5305ed0dbf74502bb8ae4',1,'cv::GNetworkType< K, std::function< R(Args...)> >::Result'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a3b2e87c13d5240a9f8b5b527554c369f',1,'cv::GNetworkType< K, std::function< std::tuple< R... >(Args...)> >::Result']]], + ['result_442',['result',['https://docs.opencv.org/4.2.0/da/dad/structcv_1_1cudev_1_1Avg.html#ac5e900e72d41f66c6783429f85f7506b',1,'cv::cudev::Avg::result()'],['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1cudev_1_1Max.html#af28b684724fb0f1679dd15218451a2b3',1,'cv::cudev::Max::result()'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1Min.html#afef9e69cc431dc05d1efa412330e0fc2',1,'cv::cudev::Min::result()'],['https://docs.opencv.org/4.2.0/d8/d60/structcv_1_1cudev_1_1Sum.html#a85f798831e6a6e5ed16fc8257bfd42f5',1,'cv::cudev::Sum::result()']]], + ['result_5fof_443',['result_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04323.html',1,'std']]], + ['result_5fof_5ft_444',['result_of_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga09f3b216a4c36c4d4070a9acbf7eebbb',1,'std::result_of_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga09f3b216a4c36c4d4070a9acbf7eebbb',1,'result_of_t(Global Namespace)']]], + ['result_5fset_2eh_445',['result_set.h',['https://docs.opencv.org/4.2.0/da/d34/result__set_8h.html',1,'']]], + ['result_5ftype_446',['result_type',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'cv::cudev::binary_function::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< double, double, double >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< float, float, float >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< Predicate::first_argument_type, Predicate::second_argument_type, Predicate::result_type >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< schar, schar, float >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< schar, schar, schar >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< short, short, float >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< short, short, short >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< T1, T2, T1 >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< T1, T2, T2 >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< uchar, uchar, float >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< uchar, uchar, uchar >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< uint, uint, float >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< uint, uint, uint >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< ushort, ushort, float >::result_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#ae95433e072c626bc13222df9ed5124af',1,'binary_function< ushort, ushort, ushort >::result_type'],['https://docs.opencv.org/4.2.0/dc/da3/structcv_1_1cudev_1_1BinaryTupleAdapter.html#aa6290c08bc6e285eca71e75849d0cb53',1,'cv::cudev::BinaryTupleAdapter::result_type'],['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a37d6d1a239ec774acc0da25aed8164b5',1,'cv::cudev::NormHamming::result_type'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#a7191f06f76c6295d8a570f64e278246e',1,'cv::cudev::NormL1::result_type'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#a9d8cf8a46bd77b3aee10e3e3bfaa6ded',1,'cv::cudev::NormL1< float >::result_type'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#a40c7ebebf02f696ffd5d3a1cf63d2715',1,'cv::cudev::NormL2::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'cv::cudev::unary_function::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< double, double >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< float, float >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< float, short >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< Op::first_argument_type, Op::result_type >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< Op::second_argument_type, Op::result_type >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< Predicate::argument_type, Predicate::result_type >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< schar, float >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< schar, schar >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< short, float >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< short, short >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< uchar, float >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< uchar, uchar >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< uint, float >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< uint, uint >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< ushort, float >::result_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ac12d58b4d4e08147fa96a3557207457e',1,'unary_function< ushort, ushort >::result_type'],['https://docs.opencv.org/4.2.0/d4/d57/structcv_1_1cudev_1_1UnaryTupleAdapter.html#ad04e19db079e85417516b8c5aa084cb7',1,'cv::cudev::UnaryTupleAdapter::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_cxx::__detail::_Ffit_finder::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_cxx::binary_compose::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_cxx::project1st::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_cxx::project2nd::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_cxx::select1st::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_cxx::select2nd::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_cxx::subtractive_rng::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_cxx::unary_compose::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_parallel::__binder1st::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_parallel::__binder2nd::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'__gnu_parallel::__unary_negate::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_EqualFromLess::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_EqualTo::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_Less::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_Lexicographic::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_LexicographicReverse::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_Multiplies::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'__gnu_parallel::_Plus::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< __shared_ptr< _Tp, _Lp >, __shared_ptr< _Tp, _Lp >, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< __weak_ptr< _Tp, _Lp >, __weak_ptr< _Tp, _Lp >, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Arg1, _Arg2, _Arg1 >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Arg1, _Arg2, _Arg2 >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Predicate::first_argument_type, _Predicate::second_argument_type, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _T1, _T2, _Res >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _T1, _T2, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Tp *, _Arg, _Ret >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Tp *, _Tp *, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Tp, _Arg, _Ret >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Tp, _Tp, _Tp >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Tp, _Tp, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< _Tp1, _Tp2, _Result >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< const _Tp *, _Arg, _Ret >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< rope< _CharT, _Alloc >, rope< _CharT, _Alloc >, rope< _CharT, _Alloc > >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< shared_ptr< _Tp >, shared_ptr< _Tp >, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< std::pair< _T1, _T2 >, std::pair< _T1, _T2 >, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< value_type, value_type, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< void, void, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'binary_function< weak_ptr< _Tp >, weak_ptr< _Tp >, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#aaa49ffe0d995ae8237a5dbad8ac7451c',1,'gamma_distribution< double >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#aaa49ffe0d995ae8237a5dbad8ac7451c',1,'gamma_distribution< result_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#ab1ad02d59f290faf3d8b33e1209cdfae',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae45488abda3f5b20d944da2da5a70001',1,'normal_distribution< double >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae45488abda3f5b20d944da2da5a70001',1,'normal_distribution< result_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::_Maybe_unary_or_binary_function< _Res, _T1 >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::_Maybe_unary_or_binary_function< _Res, _T1, _T2 >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#acc481fbef5fb023da54c1fa303d042ab',1,'std::bernoulli_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::binary_function::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::binary_negate::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::binder1st::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::binder2nd::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#af4383227c82a6c0ee7d105c6b9bad120',1,'std::binomial_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#aa8912582da5d0545839decb4e97304ce',1,'std::cauchy_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#add3353e1e6f35655c681fe7de51ec8c1',1,'std::chi_squared_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::const_mem_fun1_ref_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::const_mem_fun1_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::const_mem_fun_ref_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::const_mem_fun_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#af97ea43c5fbacbc2f8f8296336d946dd',1,'std::discard_block_engine::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a05b12fcc53882e7460348cbd46178e46',1,'std::discrete_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::divides::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::equal_to::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::experimental::fundamentals_v2::owner_less< shared_ptr< _Tp > >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::experimental::fundamentals_v2::owner_less< weak_ptr< _Tp > >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#ac591303d7888e5576784bf67be998683',1,'std::exponential_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#a1af667bbaf9fbf7448cc8b4f6c7ba52d',1,'std::extreme_value_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a81d8f625ee48920d4700c5ff1700aaea',1,'std::fisher_f_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#aaa49ffe0d995ae8237a5dbad8ac7451c',1,'std::gamma_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a3853f646d5644e294b44ccbfc8ec34b1',1,'std::geometric_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::greater::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::greater_equal::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::hash< __gnu_cxx::throw_value_limit >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::hash< __gnu_cxx::throw_value_random >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a8548a254ad408b901f446f84fc1c47b8',1,'std::independent_bits_engine::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::less::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::less_equal::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#ae47aa1543eb8eef0d874551586c0a8df',1,'std::linear_congruential_engine::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::logical_and::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::logical_not::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::logical_or::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#a26f7f5b94e8d179518168c21e7a706bf',1,'std::lognormal_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::mem_fun1_ref_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::mem_fun1_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::mem_fun_ref_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::mem_fun_t::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#ab1ad02d59f290faf3d8b33e1209cdfae',1,'std::mersenne_twister_engine::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::minus::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::modulus::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::multiplies::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::negate::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#aefbecfa1519e59a3f0937ec9eefe450e',1,'std::negative_binomial_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae45488abda3f5b20d944da2da5a70001',1,'std::normal_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::not_equal_to::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::owner_less< shared_ptr< _Tp > >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::owner_less< void >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::owner_less< weak_ptr< _Tp > >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#abb3387fe0627c23604e72a4b8e43c0f8',1,'std::piecewise_constant_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a3309d6988aede07e6360be89e5dc3f46',1,'std::piecewise_linear_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::plus::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#a5fe0082d5851e1be6383ad8d8493264e',1,'std::pointer_to_binary_function::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::pointer_to_unary_function::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a4c3d7ee8432d89d43749cb2c0aa7a588',1,'std::poisson_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06355.html#a26ac3786bd3a188268ded69f800c9dd1',1,'std::random_device::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06515.html#a3079b6a05bc5cce0bfed0a6a59c29590',1,'std::seed_seq::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a7f5d3952ecee856c85fa9bbb6bd608dc',1,'std::shuffle_order_engine::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a63439550169b26a1333639493db44e3b',1,'std::student_t_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#abbbc2513574ed100d700a15bcae13b5a',1,'std::subtract_with_carry_engine::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::unary_function::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'std::unary_negate::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a6ffc8f43a333c2aa683fe284df6d7be3',1,'std::uniform_int_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#a6cbfd150bdd9f1a1d5e7b54605b4707c',1,'std::uniform_real_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a8d02d8c1098c7944f5efdfed5824bed1',1,'std::weibull_distribution::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< __gnu_cxx::throw_value_limit, size_t >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< __gnu_cxx::throw_value_random, size_t >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _FirstArgumentType, _ResultType >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Functor::argument_type, _Functor::result_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Operation2::argument_type, _Operation1::result_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Operation::first_argument_type, _Operation::result_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Operation::second_argument_type, _Operation::result_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Pair, _Pair::first_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Pair, _Pair::second_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Predicate::argument_type, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _SecondArgumentType, _ResultType >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _T1, _Res >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Tp *, _Ret >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Tp, _Ret >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Tp, _Tp >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Tp, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< _Value, _Value >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< argument_type, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< const _Tp *, _Ret >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< pair< const _Key, _Tp >, pair< const _Key, _Tp > ::first_type >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< std::pair< _Tp, _Tp >, bool >::result_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a70d48de710aa15c5e811cbcf6c8bdd61',1,'unary_function< unsigned int, unsigned int >::result_type']]], + ['resultl_447',['ResultL',['https://docs.opencv.org/4.2.0/dc/de8/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#aa8ca41b6f9ff154f122d3f5231b980b9',1,'cv::GNetworkType< K, std::function< R(Args...)> >::ResultL'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a3535631eb028f444e9ded6eb0d68a36f',1,'cv::GNetworkType< K, std::function< std::tuple< R... >(Args...)> >::ResultL']]], + ['resultmask_448',['resultMask',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ac56296a206e88fe886470fe09738c2c8',1,'cv::Stitcher']]], + ['resultroi_449',['resultRoi',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gab7d43257ae6a1d607ee195f369d51b67',1,'cv::detail::resultRoi(const std::vector< Point > &corners, const std::vector< UMat > &images)'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gaeb641b2481aa8261c3ee087a38016485',1,'cv::detail::resultRoi(const std::vector< Point > &corners, const std::vector< Size > &sizes)'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gab7d43257ae6a1d607ee195f369d51b67',1,'resultRoi(const std::vector< Point > &corners, const std::vector< UMat > &images)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gaeb641b2481aa8261c3ee087a38016485',1,'resultRoi(const std::vector< Point > &corners, const std::vector< Size > &sizes)(Global Namespace)']]], + ['resultroiintersection_450',['resultRoiIntersection',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gac27a7690523e62854880225ec2020271',1,'cv::detail::resultRoiIntersection()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gac27a7690523e62854880225ec2020271',1,'resultRoiIntersection()(Global Namespace)']]], + ['resulttl_451',['resultTl',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga0714acd404c7b8024017d6d93a0eab3d',1,'cv::detail::resultTl()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga0714acd404c7b8024017d6d93a0eab3d',1,'resultTl()(Global Namespace)']]], + ['resulttype_452',['ResultType',['https://docs.opencv.org/4.2.0/d3/d59/structcv_1_1Hamming.html#ab8c5ba99d19941d5e2deb35a338da7b4',1,'cv::Hamming::ResultType'],['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1L1.html#a4c4639a0c362606e96b3cf626dbac79b',1,'cv::L1::ResultType'],['https://docs.opencv.org/4.2.0/dc/daa/structcv_1_1L2.html#a1452282c710b7f56201791008678b441',1,'cv::L2::ResultType'],['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html#ae8e69248bd8781896686f78a6542bf18',1,'cv::SL2::ResultType']]], + ['retainbest_453',['retainBest',['https://docs.opencv.org/4.2.0/de/db2/classcv_1_1KeyPointsFilter.html#adeb110acade85bf7a110968c6d856a1c',1,'cv::KeyPointsFilter']]], + ['retainedcornersfraction_454',['retainedCornersFraction',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#a3f5b3afbf29ed8b22d5cab5c0ac7374f',1,'cv::optflow::OpticalFlowPCAFlow']]], + ['rethrow_5fexception_455',['rethrow_exception',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#ga64d0b68338d7edbfd7d95f4177dbc442',1,'std::rethrow_exception()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#ga64d0b68338d7edbfd7d95f4177dbc442',1,'rethrow_exception()(Global Namespace)']]], + ['rethrow_5fif_5fnested_456',['rethrow_if_nested',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#gab61c4f8fae83699092207e16594f6b35',1,'std::rethrow_if_nested()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#gab61c4f8fae83699092207e16594f6b35',1,'rethrow_if_nested()(Global Namespace)']]], + ['retina_457',['Retina',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html',1,'cv::bioinspired']]], + ['retina_20and_20its_20use_20for_20image_20processing_458',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], + ['retina_20and_20real_20world_20vision_459',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], + ['retina_20introduction_460',['Bioinspired Module Retina Introduction',['https://docs.opencv.org/4.2.0/d2/d94/bioinspired_retina.html',1,'']]], + ['retina_2ehpp_461',['retina.hpp',['https://docs.opencv.org/4.2.0/d5/d40/retina_8hpp.html',1,'']]], + ['retina_2emarkdown_462',['retina.markdown',['https://docs.opencv.org/4.2.0/d7/d67/retina_8markdown.html',1,'']]], + ['retina_5fcolor_5fbayer_463',['RETINA_COLOR_BAYER',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html#ggacfb44b3f7c424d78154c5b986b1cac7daaadeb7c2a3a68e14d700f15ed4323b62',1,'cv::bioinspired::RETINA_COLOR_BAYER'],['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html#ggacfb44b3f7c424d78154c5b986b1cac7daaadeb7c2a3a68e14d700f15ed4323b62',1,'RETINA_COLOR_BAYER(Global Namespace)']]], + ['retina_5fcolor_5fdiagonal_464',['RETINA_COLOR_DIAGONAL',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html#ggacfb44b3f7c424d78154c5b986b1cac7dacde9495f290217652b4d82f07f4a18c5',1,'cv::bioinspired::RETINA_COLOR_DIAGONAL'],['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html#ggacfb44b3f7c424d78154c5b986b1cac7dacde9495f290217652b4d82f07f4a18c5',1,'RETINA_COLOR_DIAGONAL(Global Namespace)']]], + ['retina_5fcolor_5frandom_465',['RETINA_COLOR_RANDOM',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html#ggacfb44b3f7c424d78154c5b986b1cac7da3e546a6616bc41d88f973691f6a22388',1,'cv::bioinspired::RETINA_COLOR_RANDOM'],['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html#ggacfb44b3f7c424d78154c5b986b1cac7da3e546a6616bc41d88f973691f6a22388',1,'RETINA_COLOR_RANDOM(Global Namespace)']]], + ['retina_5fillusion_2emarkdown_466',['retina_illusion.markdown',['https://docs.opencv.org/4.2.0/d7/d13/retina__illusion_8markdown.html',1,'']]], + ['retina_5fmodel_2emarkdown_467',['retina_model.markdown',['https://docs.opencv.org/4.2.0/d2/d95/retina__model_8markdown.html',1,'']]], + ['retinafasttonemapping_468',['RetinaFastToneMapping',['https://docs.opencv.org/4.2.0/dd/d73/classcv_1_1bioinspired_1_1RetinaFastToneMapping.html',1,'cv::bioinspired']]], + ['retinafasttonemapping_2ehpp_469',['retinafasttonemapping.hpp',['https://docs.opencv.org/4.2.0/d2/da3/retinafasttonemapping_8hpp.html',1,'']]], + ['retinaparameters_470',['RetinaParameters',['https://docs.opencv.org/4.2.0/d2/df5/structcv_1_1bioinspired_1_1RetinaParameters.html',1,'cv::bioinspired']]], + ['retr_5fccomp_471',['RETR_CCOMP',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71a7d1d4b509fb2a9a8dc2f960357748752',1,'cv::RETR_CCOMP'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71a7d1d4b509fb2a9a8dc2f960357748752',1,'RETR_CCOMP(Global Namespace)']]], + ['retr_5fexternal_472',['RETR_EXTERNAL',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71aa7adc6d6608609fd84650f71b954b981',1,'cv::RETR_EXTERNAL'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71aa7adc6d6608609fd84650f71b954b981',1,'RETR_EXTERNAL(Global Namespace)']]], + ['retr_5ffloodfill_473',['RETR_FLOODFILL',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71acc80715d6a2a51855cb3a9a8093a9352',1,'cv::RETR_FLOODFILL'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71acc80715d6a2a51855cb3a9a8093a9352',1,'RETR_FLOODFILL(Global Namespace)']]], + ['retr_5flist_474',['RETR_LIST',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71a48b9c2cb1056f775ae50bb68288b875e',1,'cv::RETR_LIST'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71a48b9c2cb1056f775ae50bb68288b875e',1,'RETR_LIST(Global Namespace)']]], + ['retr_5ftree_475',['RETR_TREE',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71ab10df56aed56c89a026580adc9431f58',1,'cv::RETR_TREE'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga819779b9857cc2f8601e6526a3a5bc71ab10df56aed56c89a026580adc9431f58',1,'RETR_TREE(Global Namespace)']]], + ['retrievalmodes_476',['RetrievalModes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga819779b9857cc2f8601e6526a3a5bc71',1,'cv::RetrievalModes'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga819779b9857cc2f8601e6526a3a5bc71',1,'RetrievalModes(Global Namespace)']]], + ['retrieve_477',['retrieve',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a9ac7f4b1cdfe624663478568486e6712',1,'cv::VideoCapture']]], + ['return_5ftemporary_5fbuffer_478',['return_temporary_buffer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8033d777ccff23b31daf2feec4dd46ec',1,'std']]], + ['reverse_479',['Reverse',['https://eigen.tuxfamily.org/dox/classEigen_1_1Reverse.html',1,'Eigen']]], + ['reverse_480',['reverse',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7d420a62c310cd992f52c016293f969a',1,'list< __inp, __rebind_inp >::reverse()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a2ab1413dfa1c6858634407a44504a368',1,'std::forward_list::reverse()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7d420a62c310cd992f52c016293f969a',1,'std::list::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a38ea394036d8b096abf322469c80198f',1,'Eigen::DenseBase::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e2f3ac4019184abf95ca0e1a8d82866',1,'Eigen::DenseBase::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a38ea394036d8b096abf322469c80198f',1,'DenseBase< ArrayWrapper< ExpressionType > >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e2f3ac4019184abf95ca0e1a8d82866',1,'DenseBase< ArrayWrapper< ExpressionType > >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a38ea394036d8b096abf322469c80198f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e2f3ac4019184abf95ca0e1a8d82866',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a38ea394036d8b096abf322469c80198f',1,'DenseBase< Solve< Decomposition, RhsType > >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e2f3ac4019184abf95ca0e1a8d82866',1,'DenseBase< Solve< Decomposition, RhsType > >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'Eigen::VectorwiseOp::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'Eigen::VectorwiseOp::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const Derived, Horizontal >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const Derived, Horizontal >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const Derived, Vertical >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const Derived, Vertical >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::reverse() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab8caf5367e2bd636536c8a0e0c89fe15',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::reverse()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aeb0428f561b5757e2c85e8d72022eec1',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::reverse() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaeee34a9f7380d22d29f0e895d1c014e0',1,'std::reverse()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaeee34a9f7380d22d29f0e895d1c014e0',1,'reverse(_BidirectionalIterator __first, _BidirectionalIterator __last)(Global Namespace)']]], + ['reverse_3c_20const_20arraywrapper_3c_20expressiontype_20_3e_2c_20bothdirections_20_3e_481',['Reverse< const ArrayWrapper< ExpressionType >, BothDirections >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Reverse.html',1,'']]], + ['reverse_3c_20const_20derived_2c_20bothdirections_20_3e_482',['Reverse< const Derived, BothDirections >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Reverse.html',1,'']]], + ['reverse_3c_20const_20homogeneous_3c_20matrixtype_2c_20_5fdirection_20_3e_2c_20bothdirections_20_3e_483',['Reverse< const Homogeneous< MatrixType, _Direction >, BothDirections >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Reverse.html',1,'']]], + ['reverse_3c_20const_20solve_3c_20decomposition_2c_20rhstype_20_3e_2c_20bothdirections_20_3e_484',['Reverse< const Solve< Decomposition, RhsType >, BothDirections >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Reverse.html',1,'']]], + ['reverse_5fcopy_485',['reverse_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaea264a482d59bc9c99edca7595f025eb',1,'std::reverse_copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaea264a482d59bc9c99edca7595f025eb',1,'reverse_copy()(Global Namespace)']]], + ['reverse_5fiteration_486',['reverse_iteration',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html#ace925c8be06b3640abb7b6f486290dabad65704fae44294b3e727d6704fd61ab6',1,'__gnu_pbds::container_traits']]], + ['reverse_5fiterator_487',['reverse_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html',1,'std::reverse_iterator< _Iterator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab7b54ee87cf04d32f163e87e1bd0b5c5',1,'std::set::reverse_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab7b54ee87cf04d32f163e87e1bd0b5c5',1,'std::set::reverse_iterator'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5b8c0ebedd920b507f4f7ff4e19bf3c6.html#a5b8c0ebedd920b507f4f7ff4e19bf3c6',1,'nlohmann::basic_json::reverse_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a4326966837069ac59f22820fadf8ae3a',1,'std::reverse_iterator::reverse_iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a5c105d8935b69f75c65bdebc9bcef331',1,'std::reverse_iterator::reverse_iterator(iterator_type __x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#abcf630bfb989602beb089b2242b75cad',1,'std::reverse_iterator::reverse_iterator(const reverse_iterator &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#ae754a0cb3c4328241516606ef71440b0',1,'std::reverse_iterator::reverse_iterator(const reverse_iterator< _Iter > &__x)']]], + ['reverseinplace_488',['reverseInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adb8045155ea45f7961fc2a5170e1d921',1,'Eigen::DenseBase::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adb8045155ea45f7961fc2a5170e1d921',1,'DenseBase< ArrayWrapper< ExpressionType > >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adb8045155ea45f7961fc2a5170e1d921',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adb8045155ea45f7961fc2a5170e1d921',1,'DenseBase< Solve< Decomposition, RhsType > >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'Eigen::VectorwiseOp::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const Derived, Horizontal >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const Derived, Vertical >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::reverseInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ab9dd7c273eb2ba8defaab2d55156936b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::reverseInPlace()']]], + ['reversestate_489',['reverseState',['https://docs.opencv.org/4.2.0/dc/db4/structcv_1_1ml_1_1SimulatedAnnealingSolverSystem.html#a9a89d5a7241eb69287a0520ae527192f',1,'cv::ml::SimulatedAnnealingSolverSystem']]], + ['rffeaturegetter_490',['RFFeatureGetter',['https://docs.opencv.org/4.2.0/dc/dca/classcv_1_1ximgproc_1_1RFFeatureGetter.html',1,'cv::ximgproc']]], + ['rfind_491',['rfind',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aed303c4b352ab6457acd8951c36a8b43',1,'__gnu_cxx::__versa_string::rfind(const __versa_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a8f8e404eff65c29c463d5f9ec77b71ea',1,'__gnu_cxx::__versa_string::rfind(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ad21072d1890f3b24181b0781ca1eb1e9',1,'__gnu_cxx::__versa_string::rfind(const _CharT *__s, size_type __pos=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a6a0ee375ebadab1446301069152851e7',1,'__gnu_cxx::__versa_string::rfind(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'__gnu_debug::basic_string::rfind()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< _CharT >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< _CharT >::rfind(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< _CharT >::rfind(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< _CharT >::rfind(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< _CharT, _Traits, _Allocator >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< _CharT, _Traits, _Allocator >::rfind(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< _CharT, _Traits, _Allocator >::rfind(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< _CharT, _Traits, _Allocator >::rfind(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rfind(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rfind(const _Elem *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::rfind(_Elem __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< char >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< char >::rfind(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< char >::rfind(const char *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< char >::rfind(char __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rfind(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rfind(const char *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::rfind(char __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< char_type, _Traits, _Alloc >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< char_type, _Traits, _Alloc >::rfind(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< char_type, _Traits, _Alloc >::rfind(const char_type *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< char_type, _Traits, _Alloc >::rfind(char_type __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'basic_string< value_type >::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'basic_string< value_type >::rfind(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'basic_string< value_type >::rfind(const value_type *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'basic_string< value_type >::rfind(value_type __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a6cab7f0f853a0f230ea585888e21d34d',1,'std::basic_string::rfind(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a62cac31568a34b427b6faf3962f72746',1,'std::basic_string::rfind(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a252f2266eacf983c47e0f5874b9eaff6',1,'std::basic_string::rfind(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3287a95c5ac1c576aac7c1c28d3f001a',1,'std::basic_string::rfind(_CharT __c, size_type __pos=npos) const noexcept']]], + ['rgb_492',['RGB',['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1838399ee67c0957c0ae42cabfa99033a1c819f641291e88d67ab432f67023a17',1,'cv::ogl::Texture2D']]], + ['rgb_493',['rgb',['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#aa3729704cbd03b83b2e9247b16e28ad1',1,'cv::datasets::GR_skigObj']]], + ['rgb_20depth_20processing_494',['RGB-Depth Processing',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html',1,'']]], + ['rgb2gray_495',['RGB2Gray',['https://docs.opencv.org/4.2.0/d9/d5f/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2Gray.html',1,'cv::cudev::color_cvt_detail::RGB2Gray'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga2adcde9d63378940740c7b54fd00956c',1,'cv::gapi::RGB2Gray(const GMat &src)'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga8238eab93515169d2d66b50ee8a0285b',1,'cv::gapi::RGB2Gray(const GMat &src, float rY, float gY, float bY)'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga2adcde9d63378940740c7b54fd00956c',1,'RGB2Gray(const GMat &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga8238eab93515169d2d66b50ee8a0285b',1,'RGB2Gray(const GMat &src, float rY, float gY, float bY)(Global Namespace)']]], + ['rgb2hls_496',['RGB2HLS',['https://docs.opencv.org/4.2.0/de/d2b/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2HLS.html',1,'cv::cudev::color_cvt_detail']]], + ['rgb2hsv_497',['RGB2HSV',['https://docs.opencv.org/4.2.0/de/d72/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2HSV.html',1,'cv::cudev::color_cvt_detail::RGB2HSV'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#gadaaa97be932cab83d3f35f731bfe0da0',1,'cv::gapi::RGB2HSV()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#gadaaa97be932cab83d3f35f731bfe0da0',1,'RGB2HSV()(Global Namespace)']]], + ['rgb2lab_498',['RGB2Lab',['https://docs.opencv.org/4.2.0/db/df2/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2Lab.html',1,'cv::cudev::color_cvt_detail::RGB2Lab'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga74589c39069c4d068940b521990206cd',1,'cv::gapi::RGB2Lab()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga74589c39069c4d068940b521990206cd',1,'RGB2Lab()(Global Namespace)']]], + ['rgb2luv_499',['RGB2Luv',['https://docs.opencv.org/4.2.0/d0/d2c/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2Luv.html',1,'cv::cudev::color_cvt_detail']]], + ['rgb2rgb_500',['RGB2RGB',['https://docs.opencv.org/4.2.0/de/d9d/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2RGB.html',1,'cv::cudev::color_cvt_detail']]], + ['rgb2xyz_501',['RGB2XYZ',['https://docs.opencv.org/4.2.0/d1/ddf/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2XYZ.html',1,'cv::cudev::color_cvt_detail']]], + ['rgb2ycrcb_502',['RGB2YCrCb',['https://docs.opencv.org/4.2.0/da/d08/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2YCrCb.html',1,'cv::cudev::color_cvt_detail']]], + ['rgb2yuv_503',['RGB2YUV',['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1cudev_1_1color__cvt__detail_1_1RGB2YUV.html',1,'cv::cudev::color_cvt_detail::RGB2YUV'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga3cc413473e72f242f65a6df44e929d05',1,'cv::gapi::RGB2YUV()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga3cc413473e72f242f65a6df44e929d05',1,'RGB2YUV()(Global Namespace)']]], + ['rgb2yuv422_504',['RGB2YUV422',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga2698756bd4be47c4bda06be15007534f',1,'cv::gapi::RGB2YUV422()'],['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html#ga2698756bd4be47c4bda06be15007534f',1,'RGB2YUV422()(Global Namespace)']]], + ['rgb_5fto_5fbgr555_5ffunc_505',['RGB_to_BGR555_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a5393e1398b7cf941301703b40bfbca',1,'cv::cudev::RGB_to_BGR555_func'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a5393e1398b7cf941301703b40bfbca',1,'RGB_to_BGR555_func(Global Namespace)']]], + ['rgb_5fto_5fbgr565_5ffunc_506',['RGB_to_BGR565_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc256d90bf3fad6fc24e2ed38607d67',1,'cv::cudev::RGB_to_BGR565_func'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc256d90bf3fad6fc24e2ed38607d67',1,'RGB_to_BGR565_func(Global Namespace)']]], + ['rgb_5fto_5fgray_5f_507',['RGB_to_GRAY_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87d203c0c8ff0f0e62a1a3033fef5158',1,'cv::cudev::RGB_to_GRAY_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87d203c0c8ff0f0e62a1a3033fef5158',1,'RGB_to_GRAY_()(Global Namespace)']]], + ['rgb_5fto_5fgray_5ffunc_508',['RGB_to_GRAY_func',['https://docs.opencv.org/4.2.0/d8/ded/structcv_1_1cudev_1_1RGB__to__GRAY__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fhls4_5f_509',['RGB_to_HLS4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b395a8d62d373fd30c62db1b72abb29',1,'cv::cudev::RGB_to_HLS4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b395a8d62d373fd30c62db1b72abb29',1,'RGB_to_HLS4_()(Global Namespace)']]], + ['rgb_5fto_5fhls4_5ffull_5f_510',['RGB_to_HLS4_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2972e34a085b4fa67fb8d9adbdbb1624',1,'cv::cudev::RGB_to_HLS4_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2972e34a085b4fa67fb8d9adbdbb1624',1,'RGB_to_HLS4_FULL_()(Global Namespace)']]], + ['rgb_5fto_5fhls4_5ffull_5ffunc_511',['RGB_to_HLS4_FULL_func',['https://docs.opencv.org/4.2.0/d2/d93/structcv_1_1cudev_1_1RGB__to__HLS4__FULL__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fhls4_5ffull_5ffunc_3c_20float_20_3e_512',['RGB_to_HLS4_FULL_func< float >',['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1cudev_1_1RGB__to__HLS4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgb_5fto_5fhls4_5ffunc_513',['RGB_to_HLS4_func',['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1RGB__to__HLS4__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fhls4_5ffunc_3c_20float_20_3e_514',['RGB_to_HLS4_func< float >',['https://docs.opencv.org/4.2.0/d6/d6b/structcv_1_1cudev_1_1RGB__to__HLS4__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgb_5fto_5fhls_5f_515',['RGB_to_HLS_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8cf674fefaad8de6c8ebac23d683cab',1,'cv::cudev::RGB_to_HLS_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8cf674fefaad8de6c8ebac23d683cab',1,'RGB_to_HLS_()(Global Namespace)']]], + ['rgb_5fto_5fhls_5ffull_5f_516',['RGB_to_HLS_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c3fa990f8e3dcd881f3b2a6c8d21317',1,'cv::cudev::RGB_to_HLS_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c3fa990f8e3dcd881f3b2a6c8d21317',1,'RGB_to_HLS_FULL_()(Global Namespace)']]], + ['rgb_5fto_5fhls_5ffull_5ffunc_517',['RGB_to_HLS_FULL_func',['https://docs.opencv.org/4.2.0/d5/d13/structcv_1_1cudev_1_1RGB__to__HLS__FULL__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fhls_5ffull_5ffunc_3c_20float_20_3e_518',['RGB_to_HLS_FULL_func< float >',['https://docs.opencv.org/4.2.0/d1/d6f/structcv_1_1cudev_1_1RGB__to__HLS__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgb_5fto_5fhls_5ffunc_519',['RGB_to_HLS_func',['https://docs.opencv.org/4.2.0/d8/d24/structcv_1_1cudev_1_1RGB__to__HLS__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fhls_5ffunc_3c_20float_20_3e_520',['RGB_to_HLS_func< float >',['https://docs.opencv.org/4.2.0/d8/d04/structcv_1_1cudev_1_1RGB__to__HLS__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgb_5fto_5fhsv4_5f_521',['RGB_to_HSV4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f886abb121e7479edd9985f745d8378',1,'cv::cudev::RGB_to_HSV4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f886abb121e7479edd9985f745d8378',1,'RGB_to_HSV4_()(Global Namespace)']]], + ['rgb_5fto_5fhsv4_5ffull_5f_522',['RGB_to_HSV4_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f915a6c8432f1d3078f7fe0fd2d2e25',1,'cv::cudev::RGB_to_HSV4_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f915a6c8432f1d3078f7fe0fd2d2e25',1,'RGB_to_HSV4_FULL_()(Global Namespace)']]], + ['rgb_5fto_5fhsv4_5ffull_5ffunc_523',['RGB_to_HSV4_FULL_func',['https://docs.opencv.org/4.2.0/dc/d3a/structcv_1_1cudev_1_1RGB__to__HSV4__FULL__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fhsv4_5ffull_5ffunc_3c_20float_20_3e_524',['RGB_to_HSV4_FULL_func< float >',['https://docs.opencv.org/4.2.0/d5/d76/structcv_1_1cudev_1_1RGB__to__HSV4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgb_5fto_5fhsv4_5ffunc_525',['RGB_to_HSV4_func',['https://docs.opencv.org/4.2.0/d8/db1/structcv_1_1cudev_1_1RGB__to__HSV4__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fhsv4_5ffunc_3c_20float_20_3e_526',['RGB_to_HSV4_func< float >',['https://docs.opencv.org/4.2.0/d9/da5/structcv_1_1cudev_1_1RGB__to__HSV4__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgb_5fto_5fhsv_5f_527',['RGB_to_HSV_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27a648ea7aaa6f0ef6ff7b96de002983',1,'cv::cudev::RGB_to_HSV_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27a648ea7aaa6f0ef6ff7b96de002983',1,'RGB_to_HSV_()(Global Namespace)']]], + ['rgb_5fto_5fhsv_5ffull_5f_528',['RGB_to_HSV_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga735880e475f20e7e447e903d7c1d9a0f',1,'cv::cudev::RGB_to_HSV_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga735880e475f20e7e447e903d7c1d9a0f',1,'RGB_to_HSV_FULL_()(Global Namespace)']]], + ['rgb_5fto_5fhsv_5ffull_5ffunc_529',['RGB_to_HSV_FULL_func',['https://docs.opencv.org/4.2.0/da/dee/structcv_1_1cudev_1_1RGB__to__HSV__FULL__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fhsv_5ffull_5ffunc_3c_20float_20_3e_530',['RGB_to_HSV_FULL_func< float >',['https://docs.opencv.org/4.2.0/d0/d0e/structcv_1_1cudev_1_1RGB__to__HSV__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgb_5fto_5fhsv_5ffunc_531',['RGB_to_HSV_func',['https://docs.opencv.org/4.2.0/db/d4e/structcv_1_1cudev_1_1RGB__to__HSV__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fhsv_5ffunc_3c_20float_20_3e_532',['RGB_to_HSV_func< float >',['https://docs.opencv.org/4.2.0/db/d37/structcv_1_1cudev_1_1RGB__to__HSV__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgb_5fto_5flab4_5f_533',['RGB_to_Lab4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f45e190d32d9fc2a04cf38f8a6bec70',1,'cv::cudev::RGB_to_Lab4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f45e190d32d9fc2a04cf38f8a6bec70',1,'RGB_to_Lab4_()(Global Namespace)']]], + ['rgb_5fto_5flab4_5ffunc_534',['RGB_to_Lab4_func',['https://docs.opencv.org/4.2.0/d2/d21/structcv_1_1cudev_1_1RGB__to__Lab4__func.html',1,'cv::cudev']]], + ['rgb_5fto_5flab_5f_535',['RGB_to_Lab_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55502845125057811645ab720c32ecda',1,'cv::cudev::RGB_to_Lab_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55502845125057811645ab720c32ecda',1,'RGB_to_Lab_()(Global Namespace)']]], + ['rgb_5fto_5flab_5ffunc_536',['RGB_to_Lab_func',['https://docs.opencv.org/4.2.0/db/d41/structcv_1_1cudev_1_1RGB__to__Lab__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fluv4_5f_537',['RGB_to_Luv4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5927bb445f079d37182bac30870a647a',1,'cv::cudev::RGB_to_Luv4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5927bb445f079d37182bac30870a647a',1,'RGB_to_Luv4_()(Global Namespace)']]], + ['rgb_5fto_5fluv4_5ffunc_538',['RGB_to_Luv4_func',['https://docs.opencv.org/4.2.0/d5/d72/structcv_1_1cudev_1_1RGB__to__Luv4__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fluv_5f_539',['RGB_to_Luv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac216ad7dfa7d912f22a8762e7942d3a2',1,'cv::cudev::RGB_to_Luv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac216ad7dfa7d912f22a8762e7942d3a2',1,'RGB_to_Luv_()(Global Namespace)']]], + ['rgb_5fto_5fluv_5ffunc_540',['RGB_to_Luv_func',['https://docs.opencv.org/4.2.0/dc/db6/structcv_1_1cudev_1_1RGB__to__Luv__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fxyz4_5f_541',['RGB_to_XYZ4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0bc96569fd9f992a332950dbd1ab1e1',1,'cv::cudev::RGB_to_XYZ4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0bc96569fd9f992a332950dbd1ab1e1',1,'RGB_to_XYZ4_()(Global Namespace)']]], + ['rgb_5fto_5fxyz4_5ffunc_542',['RGB_to_XYZ4_func',['https://docs.opencv.org/4.2.0/d2/dd8/structcv_1_1cudev_1_1RGB__to__XYZ4__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fxyz_5f_543',['RGB_to_XYZ_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga085a1a3d18623a0ea98a09649d66c533',1,'cv::cudev::RGB_to_XYZ_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga085a1a3d18623a0ea98a09649d66c533',1,'RGB_to_XYZ_()(Global Namespace)']]], + ['rgb_5fto_5fxyz_5ffunc_544',['RGB_to_XYZ_func',['https://docs.opencv.org/4.2.0/dd/d54/structcv_1_1cudev_1_1RGB__to__XYZ__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fycrcb4_5f_545',['RGB_to_YCrCb4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga705c0bb1b78c9d6057296c0bad69e55f',1,'cv::cudev::RGB_to_YCrCb4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga705c0bb1b78c9d6057296c0bad69e55f',1,'RGB_to_YCrCb4_()(Global Namespace)']]], + ['rgb_5fto_5fycrcb4_5ffunc_546',['RGB_to_YCrCb4_func',['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1RGB__to__YCrCb4__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fycrcb_5f_547',['RGB_to_YCrCb_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga231e7f88bc237465187829fa0543e4ca',1,'cv::cudev::RGB_to_YCrCb_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga231e7f88bc237465187829fa0543e4ca',1,'RGB_to_YCrCb_()(Global Namespace)']]], + ['rgb_5fto_5fycrcb_5ffunc_548',['RGB_to_YCrCb_func',['https://docs.opencv.org/4.2.0/df/d9a/structcv_1_1cudev_1_1RGB__to__YCrCb__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fyuv4_5f_549',['RGB_to_YUV4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad07ba1c7b1cc12da97a4ef5f9bc634b',1,'cv::cudev::RGB_to_YUV4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad07ba1c7b1cc12da97a4ef5f9bc634b',1,'RGB_to_YUV4_()(Global Namespace)']]], + ['rgb_5fto_5fyuv4_5ffunc_550',['RGB_to_YUV4_func',['https://docs.opencv.org/4.2.0/d9/d7a/structcv_1_1cudev_1_1RGB__to__YUV4__func.html',1,'cv::cudev']]], + ['rgb_5fto_5fyuv_5f_551',['RGB_to_YUV_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadeac24fe8b664a71ea4b6c9199d40489',1,'cv::cudev::RGB_to_YUV_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadeac24fe8b664a71ea4b6c9199d40489',1,'RGB_to_YUV_()(Global Namespace)']]], + ['rgb_5fto_5fyuv_5ffunc_552',['RGB_to_YUV_func',['https://docs.opencv.org/4.2.0/d7/d9f/structcv_1_1cudev_1_1RGB__to__YUV__func.html',1,'cv::cudev']]], + ['rgba_553',['RGBA',['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1838399ee67c0957c0ae42cabfa99033ab30fb919ec618eaa81c28235e568ef20',1,'cv::ogl::Texture2D']]], + ['rgba_5fto_5fbgr555_5ffunc_554',['RGBA_to_BGR555_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga661584be6f9c3dbc5f0b2c86aa7bcdf2',1,'cv::cudev::RGBA_to_BGR555_func'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga661584be6f9c3dbc5f0b2c86aa7bcdf2',1,'RGBA_to_BGR555_func(Global Namespace)']]], + ['rgba_5fto_5fbgr565_5ffunc_555',['RGBA_to_BGR565_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga233a77c6b6d87ea63a5fb1b91b24baaa',1,'cv::cudev::RGBA_to_BGR565_func'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga233a77c6b6d87ea63a5fb1b91b24baaa',1,'RGBA_to_BGR565_func(Global Namespace)']]], + ['rgba_5fto_5fgray_5f_556',['RGBA_to_GRAY_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40e3d4fb3ee5a4b0ec58d4d650019050',1,'cv::cudev::RGBA_to_GRAY_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40e3d4fb3ee5a4b0ec58d4d650019050',1,'RGBA_to_GRAY_()(Global Namespace)']]], + ['rgba_5fto_5fgray_5ffunc_557',['RGBA_to_GRAY_func',['https://docs.opencv.org/4.2.0/db/d04/structcv_1_1cudev_1_1RGBA__to__GRAY__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fhls4_5f_558',['RGBA_to_HLS4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4207dbe8fca2bcdf1d083de15fb728bf',1,'cv::cudev::RGBA_to_HLS4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4207dbe8fca2bcdf1d083de15fb728bf',1,'RGBA_to_HLS4_()(Global Namespace)']]], + ['rgba_5fto_5fhls4_5ffull_5f_559',['RGBA_to_HLS4_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga543283383d42fa97657b538b6d1560f6',1,'cv::cudev::RGBA_to_HLS4_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga543283383d42fa97657b538b6d1560f6',1,'RGBA_to_HLS4_FULL_()(Global Namespace)']]], + ['rgba_5fto_5fhls4_5ffull_5ffunc_560',['RGBA_to_HLS4_FULL_func',['https://docs.opencv.org/4.2.0/d0/d56/structcv_1_1cudev_1_1RGBA__to__HLS4__FULL__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fhls4_5ffull_5ffunc_3c_20float_20_3e_561',['RGBA_to_HLS4_FULL_func< float >',['https://docs.opencv.org/4.2.0/de/d5e/structcv_1_1cudev_1_1RGBA__to__HLS4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgba_5fto_5fhls4_5ffunc_562',['RGBA_to_HLS4_func',['https://docs.opencv.org/4.2.0/d6/d31/structcv_1_1cudev_1_1RGBA__to__HLS4__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fhls4_5ffunc_3c_20float_20_3e_563',['RGBA_to_HLS4_func< float >',['https://docs.opencv.org/4.2.0/d8/dcb/structcv_1_1cudev_1_1RGBA__to__HLS4__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgba_5fto_5fhls_5f_564',['RGBA_to_HLS_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97deb97a66a2a26235e20e2102d9062d',1,'cv::cudev::RGBA_to_HLS_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97deb97a66a2a26235e20e2102d9062d',1,'RGBA_to_HLS_()(Global Namespace)']]], + ['rgba_5fto_5fhls_5ffull_5f_565',['RGBA_to_HLS_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e7129eadbdf0c96ee1aac3a9f9d3cf',1,'cv::cudev::RGBA_to_HLS_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e7129eadbdf0c96ee1aac3a9f9d3cf',1,'RGBA_to_HLS_FULL_()(Global Namespace)']]], + ['rgba_5fto_5fhls_5ffull_5ffunc_566',['RGBA_to_HLS_FULL_func',['https://docs.opencv.org/4.2.0/dd/db8/structcv_1_1cudev_1_1RGBA__to__HLS__FULL__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fhls_5ffull_5ffunc_3c_20float_20_3e_567',['RGBA_to_HLS_FULL_func< float >',['https://docs.opencv.org/4.2.0/d4/dd3/structcv_1_1cudev_1_1RGBA__to__HLS__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgba_5fto_5fhls_5ffunc_568',['RGBA_to_HLS_func',['https://docs.opencv.org/4.2.0/d9/dd5/structcv_1_1cudev_1_1RGBA__to__HLS__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fhls_5ffunc_3c_20float_20_3e_569',['RGBA_to_HLS_func< float >',['https://docs.opencv.org/4.2.0/d2/d0c/structcv_1_1cudev_1_1RGBA__to__HLS__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgba_5fto_5fhsv4_5f_570',['RGBA_to_HSV4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaccae16993ef4508827079224492619b7',1,'cv::cudev::RGBA_to_HSV4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaccae16993ef4508827079224492619b7',1,'RGBA_to_HSV4_()(Global Namespace)']]], + ['rgba_5fto_5fhsv4_5ffull_5f_571',['RGBA_to_HSV4_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37987f12b0a216f62856539b6f653fc0',1,'cv::cudev::RGBA_to_HSV4_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37987f12b0a216f62856539b6f653fc0',1,'RGBA_to_HSV4_FULL_()(Global Namespace)']]], + ['rgba_5fto_5fhsv4_5ffull_5ffunc_572',['RGBA_to_HSV4_FULL_func',['https://docs.opencv.org/4.2.0/dd/d19/structcv_1_1cudev_1_1RGBA__to__HSV4__FULL__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fhsv4_5ffull_5ffunc_3c_20float_20_3e_573',['RGBA_to_HSV4_FULL_func< float >',['https://docs.opencv.org/4.2.0/d1/d1f/structcv_1_1cudev_1_1RGBA__to__HSV4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgba_5fto_5fhsv4_5ffunc_574',['RGBA_to_HSV4_func',['https://docs.opencv.org/4.2.0/d7/d25/structcv_1_1cudev_1_1RGBA__to__HSV4__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fhsv4_5ffunc_3c_20float_20_3e_575',['RGBA_to_HSV4_func< float >',['https://docs.opencv.org/4.2.0/db/d05/structcv_1_1cudev_1_1RGBA__to__HSV4__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgba_5fto_5fhsv_5f_576',['RGBA_to_HSV_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1cfad19c6894d684050e951db36c9e',1,'cv::cudev::RGBA_to_HSV_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1cfad19c6894d684050e951db36c9e',1,'RGBA_to_HSV_()(Global Namespace)']]], + ['rgba_5fto_5fhsv_5ffull_5f_577',['RGBA_to_HSV_FULL_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1c1b90f4c96842fac605e00c795e5d4',1,'cv::cudev::RGBA_to_HSV_FULL_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1c1b90f4c96842fac605e00c795e5d4',1,'RGBA_to_HSV_FULL_()(Global Namespace)']]], + ['rgba_5fto_5fhsv_5ffull_5ffunc_578',['RGBA_to_HSV_FULL_func',['https://docs.opencv.org/4.2.0/db/d47/structcv_1_1cudev_1_1RGBA__to__HSV__FULL__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fhsv_5ffull_5ffunc_3c_20float_20_3e_579',['RGBA_to_HSV_FULL_func< float >',['https://docs.opencv.org/4.2.0/d0/d1c/structcv_1_1cudev_1_1RGBA__to__HSV__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgba_5fto_5fhsv_5ffunc_580',['RGBA_to_HSV_func',['https://docs.opencv.org/4.2.0/d1/d7d/structcv_1_1cudev_1_1RGBA__to__HSV__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fhsv_5ffunc_3c_20float_20_3e_581',['RGBA_to_HSV_func< float >',['https://docs.opencv.org/4.2.0/d0/d9b/structcv_1_1cudev_1_1RGBA__to__HSV__func_3_01float_01_4.html',1,'cv::cudev']]], + ['rgba_5fto_5flab4_5f_582',['RGBA_to_Lab4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508e8cc4a2caa74fa0400a20114c30b3',1,'cv::cudev::RGBA_to_Lab4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508e8cc4a2caa74fa0400a20114c30b3',1,'RGBA_to_Lab4_()(Global Namespace)']]], + ['rgba_5fto_5flab4_5ffunc_583',['RGBA_to_Lab4_func',['https://docs.opencv.org/4.2.0/df/d38/structcv_1_1cudev_1_1RGBA__to__Lab4__func.html',1,'cv::cudev']]], + ['rgba_5fto_5flab_5f_584',['RGBA_to_Lab_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28edacccc6e7f45042e2b60a57d1f0b0',1,'cv::cudev::RGBA_to_Lab_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28edacccc6e7f45042e2b60a57d1f0b0',1,'RGBA_to_Lab_()(Global Namespace)']]], + ['rgba_5fto_5flab_5ffunc_585',['RGBA_to_Lab_func',['https://docs.opencv.org/4.2.0/d2/d37/structcv_1_1cudev_1_1RGBA__to__Lab__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fluv4_5f_586',['RGBA_to_Luv4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d24bde7e100c726122f252ddafc9d62',1,'cv::cudev::RGBA_to_Luv4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d24bde7e100c726122f252ddafc9d62',1,'RGBA_to_Luv4_()(Global Namespace)']]], + ['rgba_5fto_5fluv4_5ffunc_587',['RGBA_to_Luv4_func',['https://docs.opencv.org/4.2.0/d7/d2e/structcv_1_1cudev_1_1RGBA__to__Luv4__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fluv_5f_588',['RGBA_to_Luv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28b70d3e2a89f2be9bdd21cf1152df99',1,'cv::cudev::RGBA_to_Luv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28b70d3e2a89f2be9bdd21cf1152df99',1,'RGBA_to_Luv_()(Global Namespace)']]], + ['rgba_5fto_5fluv_5ffunc_589',['RGBA_to_Luv_func',['https://docs.opencv.org/4.2.0/de/d88/structcv_1_1cudev_1_1RGBA__to__Luv__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fxyz4_5f_590',['RGBA_to_XYZ4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4df73ad0e8c2a5025c18ff23b67b3a70',1,'cv::cudev::RGBA_to_XYZ4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4df73ad0e8c2a5025c18ff23b67b3a70',1,'RGBA_to_XYZ4_()(Global Namespace)']]], + ['rgba_5fto_5fxyz4_5ffunc_591',['RGBA_to_XYZ4_func',['https://docs.opencv.org/4.2.0/d9/da9/structcv_1_1cudev_1_1RGBA__to__XYZ4__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fxyz_5f_592',['RGBA_to_XYZ_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9465ec862e67ccfd62bd0aa527144f56',1,'cv::cudev::RGBA_to_XYZ_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9465ec862e67ccfd62bd0aa527144f56',1,'RGBA_to_XYZ_()(Global Namespace)']]], + ['rgba_5fto_5fxyz_5ffunc_593',['RGBA_to_XYZ_func',['https://docs.opencv.org/4.2.0/d7/d53/structcv_1_1cudev_1_1RGBA__to__XYZ__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fycrcb4_5f_594',['RGBA_to_YCrCb4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0d83e83ac0313320dca81f1f34746b',1,'cv::cudev::RGBA_to_YCrCb4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0d83e83ac0313320dca81f1f34746b',1,'RGBA_to_YCrCb4_()(Global Namespace)']]], + ['rgba_5fto_5fycrcb4_5ffunc_595',['RGBA_to_YCrCb4_func',['https://docs.opencv.org/4.2.0/d0/dd4/structcv_1_1cudev_1_1RGBA__to__YCrCb4__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fycrcb_5f_596',['RGBA_to_YCrCb_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga045dae1a17dc3641471d09f7b764c5a6',1,'cv::cudev::RGBA_to_YCrCb_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga045dae1a17dc3641471d09f7b764c5a6',1,'RGBA_to_YCrCb_()(Global Namespace)']]], + ['rgba_5fto_5fycrcb_5ffunc_597',['RGBA_to_YCrCb_func',['https://docs.opencv.org/4.2.0/d1/dd1/structcv_1_1cudev_1_1RGBA__to__YCrCb__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fyuv4_5f_598',['RGBA_to_YUV4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0b611f92998604955be079b722c3ace',1,'cv::cudev::RGBA_to_YUV4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0b611f92998604955be079b722c3ace',1,'RGBA_to_YUV4_()(Global Namespace)']]], + ['rgba_5fto_5fyuv4_5ffunc_599',['RGBA_to_YUV4_func',['https://docs.opencv.org/4.2.0/d3/da0/structcv_1_1cudev_1_1RGBA__to__YUV4__func.html',1,'cv::cudev']]], + ['rgba_5fto_5fyuv_5f_600',['RGBA_to_YUV_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad49ec0b70489d8e271a5d0faf99bfd32',1,'cv::cudev::RGBA_to_YUV_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad49ec0b70489d8e271a5d0faf99bfd32',1,'RGBA_to_YUV_()(Global Namespace)']]], + ['rgba_5fto_5fyuv_5ffunc_601',['RGBA_to_YUV_func',['https://docs.opencv.org/4.2.0/db/d21/structcv_1_1cudev_1_1RGBA__to__YUV__func.html',1,'cv::cudev']]], + ['rgbd_2ehpp_602',['rgbd.hpp',['https://docs.opencv.org/4.2.0/dd/dd3/rgbd_8hpp.html',1,'']]], + ['rgbd_5fnormals_5fimpl_5f_603',['rgbd_normals_impl_',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a039c4c8dac9bdff17ddfaec856dae005',1,'cv::rgbd::RgbdNormals']]], + ['rgbd_5fnormals_5fmethod_604',['RGBD_NORMALS_METHOD',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a47b8e2bd020dac1811e6af967ab882d9',1,'cv::rgbd::RgbdNormals']]], + ['rgbd_5fnormals_5fmethod_5ffals_605',['RGBD_NORMALS_METHOD_FALS',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a47b8e2bd020dac1811e6af967ab882d9ac1f9aed92b2aade8fef82b1ed4d8af17',1,'cv::rgbd::RgbdNormals']]], + ['rgbd_5fnormals_5fmethod_5flinemod_606',['RGBD_NORMALS_METHOD_LINEMOD',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a47b8e2bd020dac1811e6af967ab882d9ae104fe72bdbb1c29b7819e00487f96e0',1,'cv::rgbd::RgbdNormals']]], + ['rgbd_5fnormals_5fmethod_5fsri_607',['RGBD_NORMALS_METHOD_SRI',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a47b8e2bd020dac1811e6af967ab882d9ae7aae37d5b4674c095bf0983e7af4c83',1,'cv::rgbd::RgbdNormals']]], + ['rgbd_5fplane_5fmethod_608',['RGBD_PLANE_METHOD',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#ab6521f3b1414cca7e1763878d7f508bc',1,'cv::rgbd::RgbdPlane']]], + ['rgbd_5fplane_5fmethod_5fdefault_609',['RGBD_PLANE_METHOD_DEFAULT',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#ab6521f3b1414cca7e1763878d7f508bca3ba35c16d774ce9c38011434e7423abb',1,'cv::rgbd::RgbdPlane']]], + ['rgbdframe_610',['RgbdFrame',['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html',1,'cv::rgbd::RgbdFrame'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#add12dd566eb4cb26f28467dddfc39535',1,'cv::rgbd::RgbdFrame::RgbdFrame()'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#a0cec5bf0daac0f332acc42ee508b9068',1,'cv::rgbd::RgbdFrame::RgbdFrame(const Mat &image, const Mat &depth, const Mat &mask=Mat(), const Mat &normals=Mat(), int ID=-1)']]], + ['rgbdicpodometry_611',['RgbdICPOdometry',['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html',1,'cv::rgbd::RgbdICPOdometry'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a857b43034bb6c6d9ee42e24ed66952ba',1,'cv::rgbd::RgbdICPOdometry::RgbdICPOdometry()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a0f13102a7ff27395e1283e26a5353114',1,'cv::rgbd::RgbdICPOdometry::RgbdICPOdometry(const Mat &cameraMatrix, float minDepth=Odometry::DEFAULT_MIN_DEPTH(), float maxDepth=Odometry::DEFAULT_MAX_DEPTH(), float maxDepthDiff=Odometry::DEFAULT_MAX_DEPTH_DIFF(), float maxPointsPart=Odometry::DEFAULT_MAX_POINTS_PART(), const std::vector< int > &iterCounts=std::vector< int >(), const std::vector< float > &minGradientMagnitudes=std::vector< float >(), int transformType=Odometry::RIGID_BODY_MOTION)']]], + ['rgbdnormals_612',['RgbdNormals',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html',1,'cv::rgbd::RgbdNormals'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a3cf169249007645a561e7005ad90b293',1,'cv::rgbd::RgbdNormals::RgbdNormals()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a9f9ebe96fefeb39ebd6cdc6c6370f373',1,'cv::rgbd::RgbdNormals::RgbdNormals(int rows, int cols, int depth, InputArray K, int window_size=5, int method=RgbdNormals::RGBD_NORMALS_METHOD_FALS)']]], + ['rgbdodometry_613',['RgbdOdometry',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html',1,'cv::rgbd::RgbdOdometry'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a6bf4a2db51a92e8cd4e08117c784d661',1,'cv::rgbd::RgbdOdometry::RgbdOdometry()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#ab1e20a2f700e1456b8860096b724ca65',1,'cv::rgbd::RgbdOdometry::RgbdOdometry(const Mat &cameraMatrix, float minDepth=Odometry::DEFAULT_MIN_DEPTH(), float maxDepth=Odometry::DEFAULT_MAX_DEPTH(), float maxDepthDiff=Odometry::DEFAULT_MAX_DEPTH_DIFF(), const std::vector< int > &iterCounts=std::vector< int >(), const std::vector< float > &minGradientMagnitudes=std::vector< float >(), float maxPointsPart=Odometry::DEFAULT_MAX_POINTS_PART(), int transformType=Odometry::RIGID_BODY_MOTION)']]], + ['rgbdplane_614',['RgbdPlane',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html',1,'cv::rgbd::RgbdPlane'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a7afba4984a244910f97cd59b3a486d8f',1,'cv::rgbd::RgbdPlane::RgbdPlane(int method=RgbdPlane::RGBD_PLANE_METHOD_DEFAULT)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a1280b0c59e66bac65cf4dfdeb3109bd3',1,'cv::rgbd::RgbdPlane::RgbdPlane(int method, int block_size, int min_size, double threshold, double sensor_error_a=0, double sensor_error_b=0, double sensor_error_c=0)']]], + ['rho_615',['RHO',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggaaedb1f94e6b143cef163622c531afd88a6bba1f5405e6fcc199a6265d9b146359',1,'cv::RHO'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggaaedb1f94e6b143cef163622c531afd88a6bba1f5405e6fcc199a6265d9b146359',1,'RHO(Global Namespace)']]], + ['rhs_616',['rhs',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#afb31bae949ea257303d8a03dfb696315',1,'cv::optflow::GPCTree::Node::rhs'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseBinaryOp.html#ae508116a8a328c0ca01df38cb4819663',1,'Eigen::CwiseBinaryOp::rhs()']]], + ['ricinterpolator_617',['RICInterpolator',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html',1,'cv::ximgproc']]], + ['ridgedetectionfilter_618',['RidgeDetectionFilter',['https://docs.opencv.org/4.2.0/d4/d36/classcv_1_1ximgproc_1_1RidgeDetectionFilter.html',1,'cv::ximgproc']]], + ['ridgefilter_2ehpp_619',['ridgefilter.hpp',['https://docs.opencv.org/4.2.0/d6/df2/ridgefilter_8hpp.html',1,'']]], + ['riemann_5fzeta_620',['riemann_zeta',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga67a6bfed9b6ab692e8c798b674431424',1,'std::riemann_zeta()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gadfc115751fa7ee0a1c44d9f7028d3a01',1,'std::tr1::riemann_zeta()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga67a6bfed9b6ab692e8c798b674431424',1,'riemann_zeta(_Tp __s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gadfc115751fa7ee0a1c44d9f7028d3a01',1,'riemann_zeta(_Tp __x)(Global Namespace)']]], + ['riemann_5fzetaf_621',['riemann_zetaf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf92063315061a56d3e2c4053156d968e',1,'std::riemann_zetaf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf92063315061a56d3e2c4053156d968e',1,'riemann_zetaf()(Global Namespace)']]], + ['riemann_5fzetal_622',['riemann_zetal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1e92da3b878d75270f38d3ec9b513086',1,'std::riemann_zetal()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1e92da3b878d75270f38d3ec9b513086',1,'riemann_zetal()(Global Namespace)']]], + ['right_623',['RIGHT',['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a025fb89c3d3b2972d36c728381ebc50e',1,'cv::datasets::RIGHT'],['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a025fb89c3d3b2972d36c728381ebc50e',1,'RIGHT(Global Namespace)']]], + ['right_624',['right',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#aee7ad615c118d559c9606c5bb98467ac',1,'cv::optflow::GPCTree::Node::right'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#aef80dc1796c5c0a694482af8dc63ae99',1,'cv::ml::DTrees::Node::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_ios< char, _Traits >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_iostream< char >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_istream< char >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_istream< char, _Traits >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_ostream< char >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_ostream< char, _Traits >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_fstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ifstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ios::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_iostream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_istream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_istringstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ofstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ostream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ostringstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_stringstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::ios_base::right'],['../structkinematics_1_1gearpos__t.html#a269b54a5ab18fb7ff52ccf1ff4c6032f',1,'kinematics::gearpos_t::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a1a23b13efe06ee9b3cd9324af25ab538',1,'std::right()']]], + ['rightbutton_625',['RightButton',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#ada240f2528500ad1615e76fb2fd9e2baa3535bdc55ffcd7ad9f7b79e210bbe6a9',1,'cv::viz::MouseEvent']]], + ['righthouseholdersequence_626',['rightHouseholderSequence',['https://eigen.tuxfamily.org/dox/group__Householder__Module.html#ga897ebce658762148f706f73a05525e89',1,'Eigen::rightHouseholderSequence()'],['https://eigen.tuxfamily.org/dox/group__Householder__Module.html#ga897ebce658762148f706f73a05525e89',1,'rightHouseholderSequence()(Global Namespace)']]], + ['rightleft_627',['rightleft',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76abf87d06fd32f99f20821216e5f768287',1,'cv::datasets::rightleft'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76abf87d06fd32f99f20821216e5f768287',1,'rightleft(Global Namespace)']]], + ['rigid_5fbody_5fmotion_628',['RIGID_BODY_MOTION',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a25c82843207af8c3e2a133dc5c887f8da754692ca9d6cadbc925cc7ce2337ed95',1,'cv::rgbd::Odometry']]], + ['ring_5fbuffer_2ehpp_629',['ring_buffer.hpp',['https://docs.opencv.org/4.2.0/d3/dcf/ring__buffer_8hpp.html',1,'']]], + ['rint_630',['rint',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a0211fe61b9e390dfd8ca213fe9c7fca3',1,'Eigen']]], + ['rintd_631',['rintd',['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a4b0f257465a70c776c077cd2b2ca3323',1,'cv::gapi::own']]], + ['rinv_632',['rinv',['https://docs.opencv.org/4.2.0/dc/d2c/structcv_1_1detail_1_1ProjectorBase.html#a4665331ebb0ea7db6d4f48151da35509',1,'cv::detail::ProjectorBase']]], + ['rlofflow_2ehpp_633',['rlofflow.hpp',['https://docs.opencv.org/4.2.0/da/da2/rlofflow_8hpp.html',1,'']]], + ['rlofopticalflowparameter_634',['RLOFOpticalFlowParameter',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html',1,'cv::optflow::RLOFOpticalFlowParameter'],['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a5ba1b4bf0d467f99e0d2a7080ea23f1c',1,'cv::optflow::RLOFOpticalFlowParameter::RLOFOpticalFlowParameter()']]], + ['rng_635',['RNG',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html',1,'cv::RNG'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a06c28035e383bc9eff22e1fad619ddf6',1,'cv::RNG::RNG()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a2d2f54a5a1145e5b9f645b8983c6ae75',1,'cv::RNG::RNG(uint64 state)']]], + ['rng_5fmt19937_636',['RNG_MT19937',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html',1,'cv::RNG_MT19937'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a53ee8b21d1281268d1cf9ae88937d2bb',1,'cv::RNG_MT19937::RNG_MT19937()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a669d829258aed084ce536c508010d1cf',1,'cv::RNG_MT19937::RNG_MT19937(unsigned s)']]], + ['rnnlayer_637',['RNNLayer',['https://docs.opencv.org/4.2.0/dd/dfd/classcv_1_1dnn_1_1RNNLayer.html',1,'cv::dnn']]], + ['ro_5fignore_5fborders_638',['RO_IGNORE_BORDERS',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a341b198401a7ad09481b19cc9dc3908fa2baa80f7a44c2b025b1cbe1f1f313147',1,'cv::ximgproc']]], + ['ro_5fstrict_639',['RO_STRICT',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a341b198401a7ad09481b19cc9dc3908fa24dd34b49f550491aed478468cf383f5',1,'cv::ximgproc']]], + ['robot_640',['robot',['../namespacerobot.html',1,'']]], + ['robot_3a_3atypes_641',['types',['../namespacerobot_1_1types.html',1,'robot']]], + ['robotveltowheelvel_642',['robotVelToWheelVel',['../classkinematics_1_1DiffDriveKinematics.html#ad1b7c74cb5310b0de806301b19835e00',1,'kinematics::DiffDriveKinematics::robotVelToWheelVel()'],['../classkinematics_1_1SwerveDriveKinematics.html#a866a5f46b733c69f60e5aa4226923f39',1,'kinematics::SwerveDriveKinematics::robotVelToWheelVel()']]], + ['robust_20estimation_643',['Robust Estimation',['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html',1,'']]], + ['robust_20features_644',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], + ['robust_20independent_20elementary_20features_645',['BRIEF (Binary Robust Independent Elementary Features)',['https://docs.opencv.org/4.2.0/dc/d7d/tutorial_py_brief.html',1,'']]], + ['robust_2ehpp_646',['robust.hpp',['https://docs.opencv.org/4.2.0/da/d0b/robust_8hpp.html',1,'']]], + ['rodrigues_647',['Rodrigues',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga61585db663d9da06b68e70cfbf6a1eac',1,'cv::Rodrigues()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga61585db663d9da06b68e70cfbf6a1eac',1,'Rodrigues()(Global Namespace)']]], + ['roi_648',['roi',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a4a39d30a977f213f196420244fe1708b',1,'cv::MatOp']]], + ['rois_649',['rois',['https://docs.opencv.org/4.2.0/d9/d17/structcv_1_1GFluidOutputRois.html#a67d0d962745b02488514d64a71acef92',1,'cv::GFluidOutputRois']]], + ['roll_650',['roll',['../structkinematics_1_1jointpos__t.html#adb2c8a622023597110d1c90776af0a07',1,'kinematics::jointpos_t']]], + ['rollingavgfilter_651',['RollingAvgFilter',['../classfilters_1_1RollingAvgFilter.html',1,'filters::RollingAvgFilter< T >'],['../classfilters_1_1RollingAvgFilter.html#a5346e90c747c361c9ab9e0c2d7b7481d',1,'filters::RollingAvgFilter::RollingAvgFilter()']]], + ['rollingguidancefilter_652',['rollingGuidanceFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gacef7fba156b072851dae79e42c39001f',1,'cv::ximgproc::rollingGuidanceFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gacef7fba156b072851dae79e42c39001f',1,'rollingGuidanceFilter()(Global Namespace)']]], + ['root_653',['root',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a504146889949abfe445f87beab4204fd',1,'cv::FileStorage']]], + ['root_20calculation_654',['root calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'Inverse square root calculation'],['https://docs.opencv.org/4.2.0/d5/dc3/group__core__hal__interface__sqrt.html',1,'Square root calculation']]], + ['root_2emarkdown_655',['root.markdown',['https://docs.opencv.org/4.2.0/d9/d1d/root_8markdown.html',1,'']]], + ['rope_656',['rope',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09243.html',1,'__gnu_cxx::rope< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00866.html',1,'(Global Namespace)']]], + ['ropeimpl_2eh_657',['ropeimpl.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01079.html',1,'']]], + ['rose_658',['rose',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a60fd9fa6f7cf66bd232c4b04a797764c',1,'cv::viz::Color']]], + ['rotate_659',['rotate',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a990d571a479b9b336f30c259fb74d18c',1,'cv::Affine3::rotate(const Mat3 &R) const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a771e0532e18299b79c922ddf77f2e362',1,'cv::Affine3::rotate(const Vec3 &rvec) const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a990d571a479b9b336f30c259fb74d18c',1,'Affine3< float >::rotate(const Mat3 &R) const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a771e0532e18299b79c922ddf77f2e362',1,'Affine3< float >::rotate(const Vec3 &rvec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a992087c44abac402a90e48218632d435',1,'Eigen::Transform::rotate()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga4ad01c0978b0ce64baa246811deeac24',1,'cv::rotate()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga55d958eceb0f871e04b1be0adc6ef1b5',1,'cv::cuda::rotate()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga4ad01c0978b0ce64baa246811deeac24',1,'rotate(InputArray src, OutputArray dst, int rotateCode)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga55d958eceb0f871e04b1be0adc6ef1b5',1,'rotate(InputArray src, OutputArray dst, Size dsize, double angle, double xShift=0, double yShift=0, int interpolation=INTER_LINEAR, Stream &stream=Stream::Null())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga52864eec5d415d353701192a9db44f7c',1,'rotate(_ForwardIterator __first, _ForwardIterator __middle, _ForwardIterator __last)(Global Namespace)']]], + ['rotate_5f180_660',['ROTATE_180',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga6f45d55c0b1cc9d97f5353a7c8a7aac2aa65044d24dcdbd15f48fe3887d2e4b16',1,'cv::ROTATE_180'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga6f45d55c0b1cc9d97f5353a7c8a7aac2aa65044d24dcdbd15f48fe3887d2e4b16',1,'ROTATE_180(Global Namespace)']]], + ['rotate_5f90_5fclockwise_661',['ROTATE_90_CLOCKWISE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga6f45d55c0b1cc9d97f5353a7c8a7aac2a0419ea25335f7df5c771a06551a91d2b',1,'cv::ROTATE_90_CLOCKWISE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga6f45d55c0b1cc9d97f5353a7c8a7aac2a0419ea25335f7df5c771a06551a91d2b',1,'ROTATE_90_CLOCKWISE(Global Namespace)']]], + ['rotate_5f90_5fcounterclockwise_662',['ROTATE_90_COUNTERCLOCKWISE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga6f45d55c0b1cc9d97f5353a7c8a7aac2a15ff5052b63aa43a334c865ebd8bb2fd',1,'cv::ROTATE_90_COUNTERCLOCKWISE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga6f45d55c0b1cc9d97f5353a7c8a7aac2a15ff5052b63aa43a334c865ebd8bb2fd',1,'ROTATE_90_COUNTERCLOCKWISE(Global Namespace)']]], + ['rotate_5fcopy_663',['rotate_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaf2a738ab86e393c9c8689708fd9afbf0',1,'std::rotate_copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaf2a738ab86e393c9c8689708fd9afbf0',1,'rotate_copy(_ForwardIterator __first, _ForwardIterator __middle, _ForwardIterator __last, _OutputIterator __result)(Global Namespace)']]], + ['rotated_20boxes_20and_20ellipses_20for_20contours_664',['Creating Bounding rotated boxes and ellipses for contours',['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'']]], + ['rotated_20brief_665',['ORB (Oriented FAST and Rotated BRIEF)',['https://docs.opencv.org/4.2.0/d1/d89/tutorial_py_orb.html',1,'']]], + ['rotatedrect_666',['RotatedRect',['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html',1,'cv::RotatedRect'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#ae1be388780b8d5faf450be18cbbf30f1',1,'cv::RotatedRect::RotatedRect()'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#aba20dfc8444fff72bd820b616f0297ee',1,'cv::RotatedRect::RotatedRect(const Point2f &center, const Size2f &size, float angle)'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a409e2505d117aa7212d40b6ec805b611',1,'cv::RotatedRect::RotatedRect(const Point2f &point1, const Point2f &point2, const Point2f &point3)']]], + ['rotatedrectangleintersection_667',['rotatedRectangleIntersection',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8740e7645628c59d238b0b22c2abe2d4',1,'cv::rotatedRectangleIntersection()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8740e7645628c59d238b0b22c2abe2d4',1,'rotatedRectangleIntersection()(Global Namespace)']]], + ['rotateedge_668',['rotateEdge',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa1179507f651b67c22e06517fbc6a145',1,'cv::Subdiv2D']]], + ['rotateflags_669',['RotateFlags',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6f45d55c0b1cc9d97f5353a7c8a7aac2',1,'cv::RotateFlags'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6f45d55c0b1cc9d97f5353a7c8a7aac2',1,'RotateFlags(Global Namespace)']]], + ['rotatevideo_670',['rotateVideo',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#a506e54c016c4fccb68eed2fe088e3929',1,'CvVideoCamera']]], + ['rotation_671',['ROTATION',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a25c82843207af8c3e2a133dc5c887f8dae3468f480f38fd07af69c3464c87d558',1,'cv::rgbd::Odometry']]], + ['rotation_672',['rotation',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ae264b90743372dac60643984ebed342e',1,'cv::Affine3::rotation(const Mat3 &R)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#acfe7474211770799f56deb8b81d829f5',1,'cv::Affine3::rotation(const Vec3 &rvec)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a755e92ce3d3af6e8599b2032a2c7ea05',1,'cv::Affine3::rotation(const Mat &data)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a6a6b70508a7d7fd7725696852da7a20c',1,'cv::Affine3::rotation() const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ae264b90743372dac60643984ebed342e',1,'Affine3< float >::rotation(const Mat3 &R)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#acfe7474211770799f56deb8b81d829f5',1,'Affine3< float >::rotation(const Vec3 &rvec)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a755e92ce3d3af6e8599b2032a2c7ea05',1,'Affine3< float >::rotation(const Mat &data)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a6a6b70508a7d7fd7725696852da7a20c',1,'Affine3< float >::rotation() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ad73300a550f878bb7f34485c3d132746',1,'Eigen::Transform::rotation()']]], + ['rotation_20estimation_673',['Rotation Estimation',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html',1,'']]], + ['rotation2d_674',['Rotation2D',['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html',1,'Eigen::Rotation2D< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a4628b82c613b7b85010afd45ea0477a2',1,'Eigen::Rotation2D::Rotation2D()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a566207478cb88f9335c912d35913a0cd',1,'Eigen::Rotation2D::Rotation2D(const MatrixBase< Derived > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a3cae6e108a999fa1a4b358b3f467aa35',1,'Eigen::Rotation2D::Rotation2D(const Rotation2D< OtherScalarType > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#afac7b8ec55325568e7c374df672d1eb1',1,'Eigen::Rotation2D::Rotation2D(const Scalar &a)']]], + ['rotation2dd_675',['Rotation2Dd',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gab7af1ccdfb6c865c27fe1fd6bd9e759f',1,'Eigen::Rotation2Dd'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gab7af1ccdfb6c865c27fe1fd6bd9e759f',1,'Rotation2Dd(Global Namespace)']]], + ['rotation2df_676',['Rotation2Df',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga35e2cace3ada497794734edb8bc33b6e',1,'Eigen::Rotation2Df'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga35e2cace3ada497794734edb8bc33b6e',1,'Rotation2Df(Global Namespace)']]], + ['rotation_5fthreshold_677',['rotation_threshold',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a09b1cfb0c4e300bef45d0315e7160685',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['rotationbase_678',['RotationBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'Eigen']]], + ['rotationbase_3c_20angleaxis_3c_20_5fscalar_20_3e_2c_203_20_3e_679',['RotationBase< AngleAxis< _Scalar >, 3 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'']]], + ['rotationbase_3c_20derived_2c_203_20_3e_680',['RotationBase< Derived, 3 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'']]], + ['rotationbase_3c_20map_3c_20const_20quaternion_3c_20_5fscalar_20_3e_2c_20_5foptions_20_3e_2c_203_20_3e_681',['RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'']]], + ['rotationbase_3c_20map_3c_20quaternion_3c_20_5fscalar_20_3e_2c_20_5foptions_20_3e_2c_203_20_3e_682',['RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'']]], + ['rotationbase_3c_20quaternion_3c_20_5fscalar_2c_20_5foptions_20_3e_2c_203_20_3e_683',['RotationBase< Quaternion< _Scalar, _Options >, 3 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'']]], + ['rotationbase_3c_20rotation2d_3c_20_5fscalar_20_3e_2c_202_20_3e_684',['RotationBase< Rotation2D< _Scalar >, 2 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html',1,'']]], + ['rotationmatrixtype_685',['RotationMatrixType',['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'Eigen::RotationBase::RotationMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'RotationBase< AngleAxis< _Scalar >, 3 >::RotationMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'RotationBase< Derived, 3 >::RotationMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::RotationMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::RotationMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::RotationMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a83602509674c9d635551998460342951',1,'RotationBase< Rotation2D< _Scalar >, 2 >::RotationMatrixType']]], + ['rotationwarper_686',['RotationWarper',['https://docs.opencv.org/4.2.0/da/db8/classcv_1_1detail_1_1RotationWarper.html',1,'cv::detail']]], + ['rotationwarperbase_687',['RotationWarperBase',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'cv::detail']]], + ['rotationwarperbase_3c_20compressedrectilinearportraitprojector_20_3e_688',['RotationWarperBase< CompressedRectilinearPortraitProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20compressedrectilinearprojector_20_3e_689',['RotationWarperBase< CompressedRectilinearProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20cylindricalportraitprojector_20_3e_690',['RotationWarperBase< CylindricalPortraitProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20cylindricalprojector_20_3e_691',['RotationWarperBase< CylindricalProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20fisheyeprojector_20_3e_692',['RotationWarperBase< FisheyeProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20mercatorprojector_20_3e_693',['RotationWarperBase< MercatorProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20paniniportraitprojector_20_3e_694',['RotationWarperBase< PaniniPortraitProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20paniniprojector_20_3e_695',['RotationWarperBase< PaniniProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20planeportraitprojector_20_3e_696',['RotationWarperBase< PlanePortraitProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20planeprojector_20_3e_697',['RotationWarperBase< PlaneProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20sphericalportraitprojector_20_3e_698',['RotationWarperBase< SphericalPortraitProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20sphericalprojector_20_3e_699',['RotationWarperBase< SphericalProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20stereographicprojector_20_3e_700',['RotationWarperBase< StereographicProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['rotationwarperbase_3c_20transversemercatorprojector_20_3e_701',['RotationWarperBase< TransverseMercatorProjector >',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html',1,'']]], + ['round_702',['round',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad9eaa98e8016ef17024a18a2f3e5bef3',1,'Eigen']]], + ['round_5ferror_703',['round_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#ae76ce654a6257e29da21c7eba1ad5142',1,'std::numeric_limits']]], + ['round_5fstyle_704',['round_style',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ae94127c8af226c7ebe44e9b39b80813b',1,'std::__numeric_limits_base::round_style'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ae94127c8af226c7ebe44e9b39b80813b',1,'std::numeric_limits::round_style']]], + ['round_5fto_5fnearest_705',['round_to_nearest',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53dbc8572a84ca50272f9e55a1e23e18a43219e58bf0b1438dce779ae47760772',1,'std']]], + ['round_5ftoward_5finfinity_706',['round_toward_infinity',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53dbc8572a84ca50272f9e55a1e23e18a39c9297336599616c46f98eaf73c6191',1,'std']]], + ['round_5ftoward_5fneg_5finfinity_707',['round_toward_neg_infinity',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53dbc8572a84ca50272f9e55a1e23e18a5e57d9d7178fe199cfd05b67e9d3c69d',1,'std']]], + ['round_5ftoward_5fzero_708',['round_toward_zero',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53dbc8572a84ca50272f9e55a1e23e18a16cd490308c5bcba330c09f844f92f1d',1,'std']]], + ['roundd_709',['roundd',['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#af2332e532138858c371946406dffc6c6',1,'cv::gapi::own']]], + ['roundup_710',['roundUp',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga36763beb301d4375d66f7e7f103e0bfa',1,'cv::roundUp(int a, unsigned int b)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gafb8b9cb1c65ed5e4777cd4c53576a95a',1,'cv::roundUp(size_t a, unsigned int b)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga36763beb301d4375d66f7e7f103e0bfa',1,'roundUp(int a, unsigned int b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gafb8b9cb1c65ed5e4777cd4c53576a95a',1,'roundUp(size_t a, unsigned int b)(Global Namespace)']]], + ['routines_711',['Hierarchical Data Format I/O routines',['https://docs.opencv.org/4.2.0/db/d77/group__hdf.html',1,'']]], + ['row_712',['row',['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#aa56a5bdfacc5ccc3c7d0fb124f10f0b5',1,'cv::cudev::GlobPtr::row(int y)'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#ae9157dc9435ac06289f71d23bf9c2077',1,'cv::cudev::GlobPtr::row(int y) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a8d6954870e3c3eacc0ea85cd38bd86b4',1,'cv::cuda::GpuMat::row()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a5a946d10ad0be1e4e733234bc76320d6',1,'cv::cudev::GpuMat_::row()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a4b22e1c23af7a7f2eef8fa478cfa7434',1,'cv::Mat::row()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a957f24ad0e833a3a145499289331277e',1,'cv::Mat_::row()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a957f24ad0e833a3a145499289331277e',1,'Mat_< double >::row()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a957f24ad0e833a3a145499289331277e',1,'Mat_< float >::row()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a957f24ad0e833a3a145499289331277e',1,'Mat_< uchar >::row()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a957f24ad0e833a3a145499289331277e',1,'Mat_< unsigned char >::row()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac3d30cfb0af133632c2f0593767b9690',1,'cv::MatExpr::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'cv::Matx::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< _Tp, cn, 1 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, 1, 3 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, 2, 2 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, 2, 3 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, 3, 3 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, 3, 4 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, 4, 4 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< double, cn, 1 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< float, 2, 3 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< float, 3, 3 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< float, cn, 1 >::row()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a84eb6938d3a7b91504e16b9a633bfae9',1,'Matx< float_type, 4, 4 >::row()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a4f493829ef460456db42c3b802ebf20f',1,'cv::UMat::row()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Triplet.html#ae88b0ad6d31daa53e298b9cc4201fdee',1,'Eigen::Triplet::row()']]], + ['row_5fsample_713',['ROW_SAMPLE',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gga9c57a2b823008dda53d2c7f7059a8710ab8565ac2eb79152a4e3c80b0e9c9fd4c',1,'cv::ml::ROW_SAMPLE'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gga9c57a2b823008dda53d2c7f7059a8710ab8565ac2eb79152a4e3c80b0e9c9fd4c',1,'ROW_SAMPLE(Global Namespace)']]], + ['rowindices_714',['rowIndices',['https://eigen.tuxfamily.org/dox/classEigen_1_1IndexedView.html#af038f6d19de286c0b959f3c1b8daa20d',1,'Eigen::IndexedView']]], + ['rowmajor_715',['RowMajor',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13a77c993a8d9f6efe5c1159fb2ab07dd4f',1,'Eigen::RowMajor'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13a77c993a8d9f6efe5c1159fb2ab07dd4f',1,'RowMajor(Global Namespace)']]], + ['rowmajorbit_716',['RowMajorBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gae4f56c2a60bbe4bd2e44c5b19cbe8762',1,'Eigen::RowMajorBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gae4f56c2a60bbe4bd2e44c5b19cbe8762',1,'RowMajorBit(Global Namespace)']]], + ['rowrange_717',['rowRange',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a0bf9a88fc518cc9986808aaf916f2182',1,'cv::cuda::GpuMat::rowRange(int startrow, int endrow) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#aabccb49164b02284e26884360b7062e8',1,'cv::cuda::GpuMat::rowRange(Range r) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ad6788fae0580dcba9af735cf3d1512b8',1,'cv::cudev::GpuMat_::rowRange(int startrow, int endrow) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a2a99ad74228c204b602c735ca044771a',1,'cv::cudev::GpuMat_::rowRange(Range r) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa6542193430356ad631a9beabc624107',1,'cv::Mat::rowRange(int startrow, int endrow) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a6f5b8257ea38a26295944e9a69caf7e7',1,'cv::Mat::rowRange(const Range &r) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a838edd92ae26c7f1cff59beda1b0518b',1,'cv::UMat::rowRange(int startrow, int endrow) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aced43849cffaea0bf71f35edeba6ea1c',1,'cv::UMat::rowRange(const Range &r) const']]], + ['rows_718',['rows',['https://docs.opencv.org/4.2.0/dc/dd4/structcv_1_1cudev_1_1AffineMapPtrSz.html#ac79b59f7b37b37aaecba89787a532a55',1,'cv::cudev::AffineMapPtrSz::rows'],['https://docs.opencv.org/4.2.0/d1/d0a/structcv_1_1cudev_1_1BinaryTransformPtrSz.html#a606602273798d1c2cb65d87a922d1e8e',1,'cv::cudev::BinaryTransformPtrSz::rows'],['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#af7711e8e03469dd42c7785a575f302fa',1,'cv::cudev::BrdBase::rows'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#a8ce5dde538604cff8ce0657fea5dfd4a',1,'cv::cudev::BrdConstant::rows'],['https://docs.opencv.org/4.2.0/db/d1c/structcv_1_1cudev_1_1CommonAreaInterPtrSz.html#acca3bbd5e7959a9d044eadef200eaf5e',1,'cv::cudev::CommonAreaInterPtrSz::rows'],['https://docs.opencv.org/4.2.0/d2/df7/structcv_1_1cudev_1_1ConstantPtrSz.html#aef3969808520d7d07d099686d76467c7',1,'cv::cudev::ConstantPtrSz::rows'],['https://docs.opencv.org/4.2.0/d2/d00/structcv_1_1cudev_1_1CubicInterPtrSz.html#a520cee3b57634b23735eb26997632151',1,'cv::cudev::CubicInterPtrSz::rows'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1cudev_1_1DerivXPtrSz.html#a7696dd37cb7c5ab5648ce9877a3da815',1,'cv::cudev::DerivXPtrSz::rows'],['https://docs.opencv.org/4.2.0/d2/dfc/structcv_1_1cudev_1_1DerivYPtrSz.html#aad4fc71ad2cd4122ef53f9633f05d525',1,'cv::cudev::DerivYPtrSz::rows'],['https://docs.opencv.org/4.2.0/de/d2e/structcv_1_1cudev_1_1GlobPtrSz.html#acac6694e561997683a142f9ff1f8afac',1,'cv::cudev::GlobPtrSz::rows'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a7385022ca9114e5f5058dbb2f12467cb',1,'cv::cuda::GpuMat::rows'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a454a7773e1423302f35819ea7720303f',1,'cv::cuda::HostMem::rows'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1cudev_1_1IntegerAreaInterPtrSz.html#a8e1c4cedfd149f97e7fb63a2966222ba',1,'cv::cudev::IntegerAreaInterPtrSz::rows'],['https://docs.opencv.org/4.2.0/da/dd9/structcv_1_1cudev_1_1LaplacianPtrSz.html#a654e16a238190bd8285d08c516387ab2',1,'cv::cudev::LaplacianPtrSz::rows'],['https://docs.opencv.org/4.2.0/d9/d2e/structcv_1_1cudev_1_1LinearInterPtrSz.html#ab5df009ffa6c436f7407b5216c114bca',1,'cv::cudev::LinearInterPtrSz::rows'],['https://docs.opencv.org/4.2.0/d5/d22/structcv_1_1cudev_1_1LutPtrSz.html#afa667ace531f787aa91a747c35a9896c',1,'cv::cudev::LutPtrSz::rows'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#abed816466c45234254d25bc59c31245e',1,'cv::Mat::rows'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a89ced746488193fb87bcd1a4794955db',1,'cv::gapi::own::detail::MatHeader::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'cv::Matx::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< _Tp, cn, 1 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, 1, 3 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, 2, 2 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, 2, 3 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, 3, 3 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, 3, 4 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, 4, 4 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< double, cn, 1 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< float, 2, 3 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< float, 3, 3 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< float, cn, 1 >::rows'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda883ccff445b70d8c5673612fcea63374',1,'Matx< float_type, 4, 4 >::rows'],['https://docs.opencv.org/4.2.0/df/dd0/structcv_1_1cudev_1_1NearestInterPtrSz.html#ab24f7a90c9b266502b127b034f873314',1,'cv::cudev::NearestInterPtrSz::rows'],['https://docs.opencv.org/4.2.0/de/d6d/structcv_1_1cudev_1_1PerspectiveMapPtrSz.html#ad1deeeca460905eaae61453ac4ecffa1',1,'cv::cudev::PerspectiveMapPtrSz::rows'],['https://docs.opencv.org/4.2.0/dd/d03/structcv_1_1cudev_1_1RemapPtr1Sz.html#aa891264c9253f93d5c32bfe9c6b34cff',1,'cv::cudev::RemapPtr1Sz::rows'],['https://docs.opencv.org/4.2.0/d4/d59/structcv_1_1cudev_1_1RemapPtr2Sz.html#af7bb64426a52dc5ed1d01962064d7a65',1,'cv::cudev::RemapPtr2Sz::rows'],['https://docs.opencv.org/4.2.0/d3/d8a/structcv_1_1cudev_1_1ResizePtrSz.html#a0d5ac19c9db9534c4c8454dc8b1fc8ae',1,'cv::cudev::ResizePtrSz::rows'],['https://docs.opencv.org/4.2.0/d2/d88/structcv_1_1cudev_1_1ScharrXPtrSz.html#a694c797bcf18ac73ca92f3c58c8da861',1,'cv::cudev::ScharrXPtrSz::rows'],['https://docs.opencv.org/4.2.0/dd/def/structcv_1_1cudev_1_1ScharrYPtrSz.html#a74a0555438ae38dee1d83396bcfbefac',1,'cv::cudev::ScharrYPtrSz::rows'],['https://docs.opencv.org/4.2.0/d0/d19/structcv_1_1cudev_1_1SingleMaskChannelsSz.html#a9ed89076c0770d2dddbca9028cb02cfe',1,'cv::cudev::SingleMaskChannelsSz::rows'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1cudev_1_1SobelXPtrSz.html#a7ab80911e8fd6c3a81d5b5a46bd95c00',1,'cv::cudev::SobelXPtrSz::rows'],['https://docs.opencv.org/4.2.0/dd/dc6/structcv_1_1cudev_1_1SobelYPtrSz.html#ae1c7129f6dbeb1f2567d6dce65d1ee66',1,'cv::cudev::SobelYPtrSz::rows'],['https://docs.opencv.org/4.2.0/d0/dc5/structcv_1_1cudev_1_1Texture.html#aa4863b492d3b31fe97ed847f11b44b6f',1,'cv::cudev::Texture::rows'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a8137e5d25233b57db5616f227f1772ee',1,'cv::UMat::rows'],['https://docs.opencv.org/4.2.0/d0/db7/structcv_1_1cudev_1_1UnaryTransformPtrSz.html#a9fbe6ddd31147857e5e98aeb05886da5',1,'cv::cudev::UnaryTransformPtrSz::rows'],['https://docs.opencv.org/4.2.0/db/d9b/structcv_1_1cudev_1_1ZipPtrSz.html#a9263fcdd10ed30ee752e895d47fc1725',1,'cv::cudev::ZipPtrSz::rows'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a4ee92cc0ce081ee8af90c8c3970b316a',1,'cv::_InputArray::rows()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#aa4545b1d1ae73330ea6c84d42cf8b459',1,'cv::ogl::Buffer::rows()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#ae60d7d5fbccd9a946b741ac8c4a4d00f',1,'cv::ogl::Texture2D::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'Eigen::EigenBase::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< FullPivLU< _MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< HouseholderQR< _MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< Inverse< PermutationType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< LLT< _MatrixType, _UpLo > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< PartialPivLU< _MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< PermutationWrapper< _IndicesType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SVDBase< Derived > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< Transpose< MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::rows()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ac22eb0695d00edd7d4a3b2d0a98b81c2',1,'EigenBase< TriangularView< MatrixType, Mode > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ac0bef8081be2c21062c1ae015bd1c1c0',1,'Eigen::HouseholderSequence::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a773e54c9ac272b998430bd27d2889277',1,'Eigen::IncompleteCholesky::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IndexedView.html#ae0d840059e7753d58f3de53da7d04ce0',1,'Eigen::IndexedView::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#abc334ba08270706556366d1cfbb05d95',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acd7ed28ee514287f933de8467768925b',1,'Eigen::PermutationBase::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acd7ed28ee514287f933de8467768925b',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acd7ed28ee514287f933de8467768925b',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acd7ed28ee514287f933de8467768925b',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acd7ed28ee514287f933de8467768925b',1,'PermutationBase< PermutationWrapper< _IndicesType > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a3cdd6cab0abd7ac01925a695fc315d34',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a62e61bb861eee306d5b069ce652b5aa5',1,'Eigen::SparseMatrix::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a62e61bb861eee306d5b069ce652b5aa5',1,'SparseMatrix< Scalar >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a62e61bb861eee306d5b069ce652b5aa5',1,'SparseMatrix< Scalar, ColMajor, int >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a62e61bb861eee306d5b069ce652b5aa5',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a62e61bb861eee306d5b069ce652b5aa5',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a1944e9fa9ce7937bfc3a87b2cb94371f',1,'Eigen::SparseMatrixBase::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a1944e9fa9ce7937bfc3a87b2cb94371f',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a1944e9fa9ce7937bfc3a87b2cb94371f',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a1944e9fa9ce7937bfc3a87b2cb94371f',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a1944e9fa9ce7937bfc3a87b2cb94371f',1,'SparseMatrixBase< Transpose< MatrixType > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a1944e9fa9ce7937bfc3a87b2cb94371f',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a02e8ec566854085df2b5c6649f43fc88',1,'Eigen::SparseQR::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#aed6e79a5a027d906f3cbf241e533b972',1,'Eigen::SPQR::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a324c2afde060bc028233e0ba81f4f24b',1,'Eigen::TriangularView::rows()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a324c2afde060bc028233e0ba81f4f24b',1,'TriangularView< const Derived, Mode >::rows()']]], + ['rows_5f_719',['rows_',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a84e3ee09ade57fd62920cf477065dde1',1,'cv::rgbd::RgbdNormals']]], + ['rows_5fcount_720',['ROWS_COUNT',['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#af65b7862adcd048ac0db862c3f709ffc',1,'cv::cuda::FastFeatureDetector::ROWS_COUNT'],['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#ae7051c0436bb5f26a691fd992bf3f2f3',1,'cv::cuda::ORB::ROWS_COUNT'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a3b5156553e52661b04bf02fa9628f746a71ea9718fc04d7b7aad87be3ae4832e1',1,'cv::cuda::SURF_CUDA::ROWS_COUNT']]], + ['rowsatcompiletime_721',['RowsAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dadb37c78ebbf15aa20b65c3b70415a1ab',1,'Eigen::DenseBase::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dadb37c78ebbf15aa20b65c3b70415a1ab',1,'DenseBase< ArrayWrapper< ExpressionType > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dadb37c78ebbf15aa20b65c3b70415a1ab',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5dadb37c78ebbf15aa20b65c3b70415a1ab',1,'DenseBase< Solve< Decomposition, RhsType > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a456cda7b9d938e57194036a41d634604',1,'Eigen::SparseMatrixBase::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a456cda7b9d938e57194036a41d634604',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a456cda7b9d938e57194036a41d634604',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a456cda7b9d938e57194036a41d634604',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a456cda7b9d938e57194036a41d634604',1,'SparseMatrixBase< Transpose< MatrixType > >::RowsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a456cda7b9d938e57194036a41d634604',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::RowsAtCompileTime']]], + ['rowspermutation_722',['rowsPermutation',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a1833ed31ad8b60b4ac3dd8dfd435f458',1,'Eigen::SparseLU']]], + ['rowstranspositions_723',['rowsTranspositions',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#abebbfc0ca6e3dd285a0ad0c907abb093',1,'Eigen::FullPivHouseholderQR']]], + ['rowstride_724',['rowStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#a95a043ca237afe8ccb18c6900091b170',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::rowStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#a63bc5874eb4e320e54eb079b43b49d22',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::rowStride()']]], + ['rowvector_725',['RowVector',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga181118570e7a0bb1cf3366180061f14f',1,'Eigen::RowVector'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga181118570e7a0bb1cf3366180061f14f',1,'RowVector(Global Namespace)']]], + ['rowvector2_726',['RowVector2',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gafbd00706e87859d2f0ad68b54e825809',1,'Eigen::RowVector2'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gafbd00706e87859d2f0ad68b54e825809',1,'RowVector2(Global Namespace)']]], + ['rowvector3_727',['RowVector3',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gaaedec7d966e8dafd1611d106333bf461',1,'Eigen::RowVector3'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gaaedec7d966e8dafd1611d106333bf461',1,'RowVector3(Global Namespace)']]], + ['rowvector4_728',['RowVector4',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gafb7f5975c1c3be1237e7f0bf589c6add',1,'Eigen::RowVector4'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gafb7f5975c1c3be1237e7f0bf589c6add',1,'RowVector4(Global Namespace)']]], + ['rowvectorx_729',['RowVectorX',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gacbfe7eb9c070bcb75ef42aec7a6fbafe',1,'Eigen::RowVectorX'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#gacbfe7eb9c070bcb75ef42aec7a6fbafe',1,'RowVectorX(Global Namespace)']]], + ['rowwise_730',['rowwise',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2da10891d4d5497f131dba68035811e4',1,'Eigen::DenseBase::rowwise()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2da10891d4d5497f131dba68035811e4',1,'DenseBase< ArrayWrapper< ExpressionType > >::rowwise()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2da10891d4d5497f131dba68035811e4',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::rowwise()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2da10891d4d5497f131dba68035811e4',1,'DenseBase< Solve< Decomposition, RhsType > >::rowwise()']]], + ['rprop_731',['RPROP',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a012b34ee340b5d4d11b6844e12816181aded0d171ce651e6701a3426e192e04c9',1,'cv::ml::ANN_MLP']]], + ['rqdecomp3x3_732',['RQDecomp3x3',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga1aaacb6224ec7b99d34866f8f9baac83',1,'cv::RQDecomp3x3()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga1aaacb6224ec7b99d34866f8f9baac83',1,'RQDecomp3x3()(Global Namespace)']]], + ['rref_733',['rref',['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html#a9075bbb4af21ec947eed45b4e39020a8',1,'cv::detail::VectorRef::rref()'],['https://docs.opencv.org/4.2.0/d2/dab/classcv_1_1detail_1_1VectorRefT.html#a079d259a6734dd2ef250caa2fd5af0a0',1,'cv::detail::VectorRefT::rref()']]], + ['rs_734',['RS',['https://docs.opencv.org/4.2.0/d0/dc4/classcv_1_1GFluidKernel.html#a1f42985cb666b38d9a398787d602b0f4',1,'cv::GFluidKernel']]], + ['rshift_735',['rshift',['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga87af0b66358cc302676f35c1fd56c2ed',1,'cv::cuda::rshift()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga87af0b66358cc302676f35c1fd56c2ed',1,'rshift()(Global Namespace)']]], + ['rsqrt_736',['rsqrt',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a6374a6a9e972e9358d7ab3fced32d7d5',1,'Eigen']]], + ['rtrees_737',['RTrees',['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html',1,'cv::ml']]], + ['rules_738',['Style Rules',['../md_StyleGuide.html#autotoc_md1',1,'']]], + ['rulesoption_739',['RulesOption',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a341b198401a7ad09481b19cc9dc3908f',1,'cv::ximgproc']]], + ['run_740',['run',['https://docs.opencv.org/4.2.0/de/d3a/classcv_1_1text_1_1BaseOCR.html#a5c67898881a8d309eb805811e574f9c5',1,'cv::text::BaseOCR::run(Mat &image, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0)=0'],['https://docs.opencv.org/4.2.0/de/d3a/classcv_1_1text_1_1BaseOCR.html#acffec5372da8bb875e5d04acc8c5410a',1,'cv::text::BaseOCR::run(Mat &image, Mat &mask, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0)=0'],['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html#aae7829f9d9d9d9aa31c7e35c8c7ed501',1,'cv::sfm::BaseSFM::run(InputArrayOfArrays points2d)=0'],['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html#a4ef14d29bb59545938d59e62001acf73',1,'cv::sfm::BaseSFM::run(InputArrayOfArrays points2d, InputOutputArray K, OutputArray Rs, OutputArray Ts, OutputArray points3d)=0'],['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html#ac51a3a5a28945980de39c01d18c80014',1,'cv::sfm::BaseSFM::run(const std::vector< String > &images)=0'],['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html#aa96e83566228a48f46dcd9308e243f97',1,'cv::sfm::BaseSFM::run(const std::vector< String > &images, InputOutputArray K, OutputArray Rs, OutputArray Ts, OutputArray points3d)=0'],['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a1038295b9626937e0d3c34c728f23ab1',1,'cv::DetectionBasedTracker::run()'],['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a6ada71a54726caa84a34787e66b7ea93',1,'cv::text::ERFilter::run()'],['https://docs.opencv.org/4.2.0/d3/dea/classcv_1_1videostab_1_1FastMarchingMethod.html#a49129aadd40ca8c74cf93c7985898dfb',1,'cv::videostab::FastMarchingMethod::run()'],['https://docs.opencv.org/4.2.0/de/d24/classcv_1_1videostab_1_1IDenseOptFlowEstimator.html#a5e961d8501881347a113d3cb75b52aae',1,'cv::videostab::IDenseOptFlowEstimator::run()'],['https://docs.opencv.org/4.2.0/df/de2/classcv_1_1videostab_1_1ISparseOptFlowEstimator.html#aec9ea9902f650a42d7e672a4e331f2fc',1,'cv::videostab::ISparseOptFlowEstimator::run()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a1ce6b92ee1801a96913402483f086e4a',1,'cv::ocl::Kernel::run()'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#aa5697f2be7791040e7fb45d938211a93',1,'cv::dnn::Layer::run()'],['https://docs.opencv.org/4.2.0/d3/d6d/classcv_1_1LMSolver.html#ae32456aafdc15dfef2c757ba744947b8',1,'cv::LMSolver::run()'],['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#a6307a1a7d1806673e7fcb4ab0b0bf5f1',1,'cv::multicalib::MultiCameraCalibration::run()'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#ad029e85a6d22726a475a76c5cb778b05',1,'cv::text::OCRBeamSearchDecoder::run(Mat &image, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a1393d97ac9fab46d5b74369dc21c4370',1,'cv::text::OCRBeamSearchDecoder::run(Mat &image, Mat &mask, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a4efae35246e4df8d28ddd9f51ab0ecfb',1,'cv::text::OCRBeamSearchDecoder::run(InputArray image, int min_confidence, int component_level=0)'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a8107fa523397a2432a0adb7d821ef8a1',1,'cv::text::OCRBeamSearchDecoder::run(InputArray image, InputArray mask, int min_confidence, int component_level=0)'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a80404ecd8a37416ae7987fe0b78583ab',1,'cv::text::OCRHMMDecoder::run(Mat &image, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#af24a91ec82b508f2f09784c32c2a78cf',1,'cv::text::OCRHMMDecoder::run(Mat &image, Mat &mask, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#aee29f2f3895898c8bac19768c2791b77',1,'cv::text::OCRHMMDecoder::run(InputArray image, int min_confidence, int component_level=0)'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a9212b8054453d8c90b4f2f31196f0403',1,'cv::text::OCRHMMDecoder::run(InputArray image, InputArray mask, int min_confidence, int component_level=0)'],['https://docs.opencv.org/4.2.0/d0/d8f/classcv_1_1text_1_1OCRHolisticWordRecognizer.html#a9c97b95245de56e8dff30c1ff8b77206',1,'cv::text::OCRHolisticWordRecognizer::run(Mat &image, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=OCR_LEVEL_WORD) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d0/d8f/classcv_1_1text_1_1OCRHolisticWordRecognizer.html#aa9e1ada2d991725cf3814d546e659b00',1,'cv::text::OCRHolisticWordRecognizer::run(Mat &image, Mat &mask, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=OCR_LEVEL_WORD) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html#af2bb9e7710a5bf616367d8898334001c',1,'cv::text::OCRTesseract::run(Mat &image, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html#a4c1a45ae9390021c99363f0aada3f0ea',1,'cv::text::OCRTesseract::run(Mat &image, Mat &mask, std::string &output_text, std::vector< Rect > *component_rects=NULL, std::vector< std::string > *component_texts=NULL, std::vector< float > *component_confidences=NULL, int component_level=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html#ae53f76683d0267321929e6cda6bb2f03',1,'cv::text::OCRTesseract::run(InputArray image, int min_confidence, int component_level=0)'],['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html#ab2ce0c6ab351e97d7f60a7274c8e9186',1,'cv::text::OCRTesseract::run(InputArray image, InputArray mask, int min_confidence, int component_level=0)'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a929964603a3e5d322245b83ac348cb13',1,'cv::detail::PairwiseSeamFinder::run()'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a9d18358b520c4dd7931a9154cc053649',1,'cv::bioinspired::Retina::run()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#a04cf041a1fbe19d200670b3cda861b83',1,'cv::sfm::SFMLibmvEuclideanReconstruction::run(InputArrayOfArrays points2d) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#aa091d5eb8e36fc8406acd22900a06681',1,'cv::sfm::SFMLibmvEuclideanReconstruction::run(InputArrayOfArrays points2d, InputOutputArray K, OutputArray Rs, OutputArray Ts, OutputArray points3d) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#a9dc08fa4dccd9ed1055c452993a8c1be',1,'cv::sfm::SFMLibmvEuclideanReconstruction::run(const std::vector< String > &images) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#a90ad868b27133f361a6a326c722500e2',1,'cv::sfm::SFMLibmvEuclideanReconstruction::run(const std::vector< String > &images, InputOutputArray K, OutputArray Rs, OutputArray Ts, OutputArray points3d) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d1/d4b/classcv_1_1videostab_1_1SparsePyrLkOptFlowEstimator.html#af36c9713b943b6f5cd97875bcae34b0a',1,'cv::videostab::SparsePyrLkOptFlowEstimator::run()'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#a843674ce05963fc006b0639eb6f2c6d4',1,'cv::bioinspired::TransientAreasSegmentationModule::run()']]], + ['run_20deep_20networks_20in_20browser_741',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], + ['run_20deep_20networks_20on_20android_20device_742',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], + ['run_20length_20encoded_20image_743',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], + ['run_5flength_5fmorphology_2ehpp_744',['run_length_morphology.hpp',['https://docs.opencv.org/4.2.0/d2/d17/run__length__morphology_8hpp.html',1,'']]], + ['runbyimageborder_745',['runByImageBorder',['https://docs.opencv.org/4.2.0/de/db2/classcv_1_1KeyPointsFilter.html#a8feeffd95d167db42575f2dce2337ed6',1,'cv::KeyPointsFilter']]], + ['runbykeypointsize_746',['runByKeypointSize',['https://docs.opencv.org/4.2.0/de/db2/classcv_1_1KeyPointsFilter.html#a0970d203b5cda500d8f77bd92ae0a894',1,'cv::KeyPointsFilter']]], + ['runbypixelsmask_747',['runByPixelsMask',['https://docs.opencv.org/4.2.0/de/db2/classcv_1_1KeyPointsFilter.html#aed11c95cb56f2d0f42d89b37a81baa02',1,'cv::KeyPointsFilter']]], + ['running_748',['running',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#ac14f0dc858286d0879c524988eded738',1,'CvAbstractCamera::running'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#a7e2c1bb4e40bf69706805c7ba53e4ef9',1,'cv::GStreamingCompiled::running()']]], + ['runprepassifnecessary_749',['runPrePassIfNecessary',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a45d12141d2137d94aa862ea4560f6155',1,'cv::videostab::TwoPassStabilizer']]], + ['runprofiling_750',['runProfiling',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a9e3957a938a48d16a665bfc170759461',1,'cv::ocl::Kernel']]], + ['runstateestimator_751',['runStateEstimator',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#ab79490081e952351fd8f46e41974442d',1,'cv::TrackerModel']]], + ['runtask_752',['runTask',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#afdc8795606e2db6d3186d8fb339d4623',1,'cv::ocl::Kernel']]], + ['runtime_5ferror_753',['runtime_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02811.html',1,'std::runtime_error'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02811.html#afce1a363a3b2215518ac16649f8b04c8',1,'std::runtime_error::runtime_error()']]], + ['rvec_754',['rvec',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a2b55e155790f606db5eb913bd350645b',1,'cv::Affine3::rvec()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a2b55e155790f606db5eb913bd350645b',1,'Affine3< float >::rvec()']]], + ['rw_755',['Rw',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#a99638d4d691fbb2b8d2adf7e40f60440',1,'cv::datasets::join']]], + ['rx_756',['Rx',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#aaa084bf27556e6ac0ef23699c6eaf8c9',1,'cv::datasets::join']]], + ['ry_757',['Ry',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#a1cae60b94eaa450e838934b659ff3fa1',1,'cv::datasets::join']]], + ['rz_758',['Rz',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#af33b7142437444f5f4fb83f545bfbbcc',1,'cv::datasets::join']]] ]; diff --git a/search/all_1c.js b/search/all_1c.js index 30c5a0a9..a2e53d4a 100644 --- a/search/all_1c.js +++ b/search/all_1c.js @@ -1,7 +1,7 @@ var searchData= [ - ['s_0',['s',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a41e897e2deb89c8caa169194f87c2a73',1,'cv::MatExpr::s'],['https://docs.opencv.org/4.2.0/d4/d66/structcv_1_1datasets_1_1skeleton.html#a5d353fe702215021f6d753393b80a055',1,'cv::datasets::skeleton::s']]], - ['s_1',['S',['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#a29a25d70c8b7090fc0bba855ec42696c',1,'cv::face::FacemarkAAM::Model']]], + ['s_0',['S',['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#a29a25d70c8b7090fc0bba855ec42696c',1,'cv::face::FacemarkAAM::Model']]], + ['s_1',['s',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a41e897e2deb89c8caa169194f87c2a73',1,'cv::MatExpr::s'],['https://docs.opencv.org/4.2.0/d4/d66/structcv_1_1datasets_1_1skeleton.html#a5d353fe702215021f6d753393b80a055',1,'cv::datasets::skeleton::s']]], ['s0_2',['s0',['https://docs.opencv.org/4.2.0/de/d4f/structcv_1_1face_1_1FacemarkAAM_1_1Data.html#a970606e00ede24bd01b33e9b7e4053d2',1,'cv::face::FacemarkAAM::Data::s0'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#a5829fa9198c6a27fb3a13a17a34dc2f9',1,'cv::face::FacemarkAAM::Model::s0']]], ['safe_20container_20of_20any_20type_3',['Type-safe container of any type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html',1,'']]], ['safe_5fbase_2eh_4',['safe_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00776.html',1,'']]], @@ -103,1845 +103,1836 @@ var searchData= ['saving_2eh_100',['saving.h',['https://docs.opencv.org/4.2.0/de/dd5/saving_8h.html',1,'']]], ['sax_5fparse_101',['sax_parse',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a12b382c6407da5543827ce4b24bb5008.html#a12b382c6407da5543827ce4b24bb5008',1,'nlohmann::basic_json::sax_parse(InputType &&i, SAX *sax, input_format_t format=input_format_t::json, const bool strict=true, const bool ignore_comments=false)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab62241c2694a054818edf2f66d72f113.html#ab62241c2694a054818edf2f66d72f113',1,'nlohmann::basic_json::sax_parse(IteratorType first, IteratorType last, SAX *sax, input_format_t format=input_format_t::json, const bool strict=true, const bool ignore_comments=false)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aef9ef0a817ecde8bf270653e8706c150.html#aef9ef0a817ecde8bf270653e8706c150',1,'nlohmann::basic_json::sax_parse(detail::span_input_adapter &&i, SAX *sax, input_format_t format=input_format_t::json, const bool strict=true, const bool ignore_comments=false)']]], ['sbumpc_102',['sbumpc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a72d8037e21ad370e3643ff3c865f91f9',1,'__gnu_cxx::enc_filebuf::sbumpc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a72d8037e21ad370e3643ff3c865f91f9',1,'__gnu_cxx::stdio_filebuf::sbumpc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a72d8037e21ad370e3643ff3c865f91f9',1,'__gnu_cxx::stdio_sync_filebuf::sbumpc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a72d8037e21ad370e3643ff3c865f91f9',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sbumpc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a72d8037e21ad370e3643ff3c865f91f9',1,'basic_filebuf< char_type, traits_type >::sbumpc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a72d8037e21ad370e3643ff3c865f91f9',1,'basic_streambuf< _Elem, _Tr >::sbumpc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a72d8037e21ad370e3643ff3c865f91f9',1,'basic_streambuf< char, _Traits >::sbumpc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a72d8037e21ad370e3643ff3c865f91f9',1,'basic_streambuf< char, char_traits< char > >::sbumpc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a72d8037e21ad370e3643ff3c865f91f9',1,'std::basic_filebuf::sbumpc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a72d8037e21ad370e3643ff3c865f91f9',1,'std::basic_streambuf::sbumpc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a72d8037e21ad370e3643ff3c865f91f9',1,'std::basic_stringbuf::sbumpc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a72d8037e21ad370e3643ff3c865f91f9',1,'std::wbuffer_convert::sbumpc()']]], - ['scalar_103',['Scalar',['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html',1,'cv::gapi::own::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#acd9b10692d7d726b28670e4d3a282fe8',1,'Eigen::AngleAxis::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a61035d40c9498bb1d47628cdd4946785',1,'Eigen::ComplexEigenSolver::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a9a8ee9df37ee1f90d0e53103c58683c0',1,'Eigen::ComplexSchur::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a9a8ee9df37ee1f90d0e53103c58683c0',1,'ComplexSchur< MatrixType >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5feed465b3a8e60c47e73ecce83e39a2',1,'Eigen::DenseBase::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5feed465b3a8e60c47e73ecce83e39a2',1,'DenseBase< ArrayWrapper< ExpressionType > >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5feed465b3a8e60c47e73ecce83e39a2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5feed465b3a8e60c47e73ecce83e39a2',1,'DenseBase< Solve< Decomposition, RhsType > >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a017d49fe0d59874b70a2fcf35e5aa373',1,'Eigen::EigenSolver::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#afb318d0b097ff8dd5a7410d31317ca47',1,'Eigen::GeneralizedEigenSolver::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a9420c36226cae7d92da8308a3f97ac2f',1,'Eigen::HessenbergDecomposition::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a9420c36226cae7d92da8308a3f97ac2f',1,'HessenbergDecomposition< MatrixType >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ac20c665ece0f197a712a2a39ae72e4e4',1,'Eigen::Rotation2D::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'Eigen::RotationBase::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'RotationBase< AngleAxis< _Scalar >, 3 >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'RotationBase< Derived, 3 >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'RotationBase< Rotation2D< _Scalar >, 2 >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a0bfcedf4245b6846007ca4f01e4feb1f',1,'Eigen::SelfAdjointEigenSolver::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af52acc0942ece2de9b6db4a99cc6656e',1,'Eigen::SelfAdjointView::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af52acc0942ece2de9b6db4a99cc6656e',1,'SelfAdjointView< const Derived, UpLo >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a4e69ced9d651745b8ed4eda46f41795d',1,'Eigen::Transform::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#ad596bf21ced4b902cc242205df486e21',1,'Eigen::Translation::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a04c4339f58f1210c5d4d34b1bd7ae283',1,'Eigen::UniformScaling::Scalar'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#afcfa42891883e0ae30694627e7f444fa',1,'cv::gapi::own::Scalar::Scalar()=default'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#a1d170debea8230c26f2b5a652479d2e2',1,'cv::gapi::own::Scalar::Scalar(double v0)'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#a6db773a6287163de63271d3ae7c267a0',1,'cv::gapi::own::Scalar::Scalar(double v0, double v1, double v2=0, double v3=0)']]], - ['scalar_104',['SCALAR',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa8f3d9a4b6a7b7f2c7afa61ca113d0db9',1,'SCALAR(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa8f3d9a4b6a7b7f2c7afa61ca113d0db9',1,'SCALAR(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa8f3d9a4b6a7b7f2c7afa61ca113d0db9',1,'SCALAR(Global Namespace)']]], - ['scalar_105',['Scalar',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga599fe92e910c027be274233eccad7beb',1,'cv::Scalar'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga599fe92e910c027be274233eccad7beb',1,'Scalar(Global Namespace)']]], - ['scalar_20types_106',['Scalar types',['https://eigen.tuxfamily.org/dox/TopicScalarTypes.html',1,'']]], - ['scalar_20types_107',['Using custom scalar types',['https://eigen.tuxfamily.org/dox/TopicCustomizing_CustomScalar.html',1,'']]], - ['scalar_2ehpp_108',['scalar.hpp',['https://docs.opencv.org/4.2.0/d5/d4c/scalar_8hpp.html',1,'']]], - ['scalar_5f_109',['Scalar_',['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html',1,'cv::Scalar_< _Tp >'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae1f585cbf709bbce60762f802c571211',1,'cv::Scalar_::Scalar_()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae64e021266b9f7661f66a3c77d175c1f',1,'cv::Scalar_::Scalar_(_Tp v0, _Tp v1, _Tp v2=0, _Tp v3=0)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a3929afa654b588e2d9b2dde86060e689',1,'cv::Scalar_::Scalar_(_Tp v0)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a0224be57cfd1de9cca1edda69fc2e096',1,'cv::Scalar_::Scalar_(const Scalar_ &s)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a25e9ca0286c257b28cc23c34a34d715c',1,'cv::Scalar_::Scalar_(Scalar_ &&s) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a79f00ebc582fc7e231b4784fb1308c98',1,'cv::Scalar_::Scalar_(const Vec< _Tp2, cn > &v)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae1f585cbf709bbce60762f802c571211',1,'Scalar_< double >::Scalar_()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae64e021266b9f7661f66a3c77d175c1f',1,'Scalar_< double >::Scalar_(double v0, double v1, double v2=0, double v3=0)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a3929afa654b588e2d9b2dde86060e689',1,'Scalar_< double >::Scalar_(double v0)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a0224be57cfd1de9cca1edda69fc2e096',1,'Scalar_< double >::Scalar_(const Scalar_ &s)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a25e9ca0286c257b28cc23c34a34d715c',1,'Scalar_< double >::Scalar_(Scalar_ &&s) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a79f00ebc582fc7e231b4784fb1308c98',1,'Scalar_< double >::Scalar_(const Vec< _Tp2, cn > &v)']]], - ['scalar_5f_3c_20double_20_3e_110',['Scalar_< double >',['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html',1,'']]], - ['scalar_5fwrapper_111',['scalar_wrapper',['https://docs.opencv.org/4.2.0/d2/d64/structcv_1_1detail_1_1scalar__wrapper.html',1,'cv::detail::scalar_wrapper'],['https://docs.opencv.org/4.2.0/d2/d64/structcv_1_1detail_1_1scalar__wrapper.html#af5dfa2a66357359c7243439ea79e2be0',1,'cv::detail::scalar_wrapper::scalar_wrapper()']]], - ['scalar_5fwrapper_5focl_112',['scalar_wrapper_ocl',['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1detail_1_1scalar__wrapper__ocl.html',1,'cv::detail::scalar_wrapper_ocl'],['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1detail_1_1scalar__wrapper__ocl.html#adb93b18b25e7e063b3a9724ddf0259f7',1,'cv::detail::scalar_wrapper_ocl::scalar_wrapper_ocl()']]], - ['scalarbinaryoptraits_113',['ScalarBinaryOpTraits',['https://eigen.tuxfamily.org/dox/structEigen_1_1ScalarBinaryOpTraits.html',1,'Eigen']]], - ['scale_114',['scale',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html#af2774ac571ba4eec364f95e1e8c51e83',1,'cv::face::FacemarkAAM::Config::scale'],['https://docs.opencv.org/4.2.0/d3/d34/structcv_1_1DetectionROI.html#a52c1cbb159bc79148bcdb70ecdb1b590',1,'cv::DetectionROI::scale'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#aa51a2d6c9364ca64dce470874d2ab971',1,'cv::line_descriptor::LSDParam::scale'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1dnn_1_1PowerLayer.html#acf390557940b3935f4ffb9ad9b9e671f',1,'cv::dnn::PowerLayer::scale'],['https://docs.opencv.org/4.2.0/dc/d2c/structcv_1_1detail_1_1ProjectorBase.html#a4677711ed88bb184e14781e716efe4c3',1,'cv::detail::ProjectorBase::scale'],['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html#ae59ab0d4f97c5066b7922cfcfcb42abd',1,'cv::reg::Map::scale()'],['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#a070be78fef2a9320a8b7fe4dc40142b9',1,'cv::reg::MapAffine::scale()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#af53d8ef43de3cc8cfe4ac8308f9391f2',1,'cv::reg::MapProjec::scale()'],['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html#ad42ce1e14e2e170ce04d5c26fb2637c3',1,'cv::reg::MapShift::scale()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a8eea19fd9f6a6966a1a810acda22f93d',1,'Eigen::Transform::scale(const MatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a7757f5d9e708e625cbd936b19269b2c8',1,'Eigen::Transform::scale(const Scalar &s)'],['https://docs.opencv.org/4.2.0/d6/d84/namespacecv_1_1quality_1_1quality__utils.html#ae55d1c89ff5761730174745401162743',1,'cv::quality::quality_utils::scale()']]], - ['scale_20invariant_20feature_20transform_115',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], - ['scale_5ffactor_116',['scale_factor',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#a3e841dd1333e7bfd731f29868c65f3dc',1,'NCVBroxOpticalFlowDescriptor']]], - ['scale_5flr_117',['scale_lr',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a59995c780abd9d169dbb5e6ac70177e6',1,'cv::TrackerCSRT::Params']]], - ['scale_5fmodel_5fmax_5farea_118',['scale_model_max_area',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a99de20111cb8cdd851abd4e83f36bb87',1,'cv::TrackerCSRT::Params']]], - ['scale_5fsigma_5ffactor_119',['scale_sigma_factor',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a128ea11a74e3a6435843fd8519f573a9',1,'cv::TrackerCSRT::Params']]], - ['scale_5fstep_120',['scale_step',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a40502273aa746c2bd27d37bdffffe1ac',1,'cv::TrackerCSRT::Params']]], - ['scaleadd_121',['scaleAdd',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9e0845db4135f55dcf20227402f00d98',1,'cv::scaleAdd()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga9670da19276361e1681f69226e2071fb',1,'cv::cuda::scaleAdd()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9e0845db4135f55dcf20227402f00d98',1,'scaleAdd(InputArray src1, double alpha, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga9670da19276361e1681f69226e2071fb',1,'scaleAdd(InputArray src1, double alpha, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['scalefactor_122',['scaleFactor',['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html#ac6991f5ba195b3141efbe2f93f2cd4b5',1,'cv::face::CParams::scaleFactor'],['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#a09e466966d8e1d37f7eb1200ecdf090a',1,'cv::DetectionBasedTracker::IDetector::scaleFactor']]], - ['scalelayer_123',['ScaleLayer',['https://docs.opencv.org/4.2.0/dd/dde/classcv_1_1dnn_1_1ScaleLayer.html',1,'cv::dnn']]], - ['scales_124',['scales',['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#a1c01ce9d2703384a1f937c276448d973',1,'cv::face::FacemarkAAM::Model::scales'],['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#ad3a5005b001e67945de5bcc66acb954b',1,'cv::face::FacemarkAAM::Params::scales']]], - ['scaling_125',['Scaling',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a109425bca2048c3df19249c04e73715c',1,'Eigen::Scaling(const MatrixBase< Derived > &coeffs)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#aafd4d881e7a6c2a68c1db03e261c767b',1,'Eigen::Scaling(const Scalar &sx, const Scalar &sy)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a162d759175d7c5214f33fefb30862815',1,'Eigen::Scaling(const Scalar &sx, const Scalar &sy, const Scalar &sz)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a76386154f2cdb77190759744830422d1',1,'Eigen::Scaling(const std::complex< RealScalar > &s)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad2e71727718ca788680b3aa9eb485f98',1,'Eigen::Scaling(double s)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a02918175ff75e5df9fd291cf5fc3fd1b',1,'Eigen::Scaling(float s)']]], - ['scalings_126',['scalingS',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a30d66dd77147a84ec3302e7d5fe5d924',1,'Eigen::IncompleteCholesky']]], - ['scan_20images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_127',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], - ['scan_2ehpp_128',['scan.hpp',['https://docs.opencv.org/4.2.0/d5/dc3/modules_2core_2include_2opencv2_2core_2cuda_2scan_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/de8/contrib_2modules_2cudev_2include_2opencv2_2cudev_2block_2scan_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/de6/contrib_2modules_2cudev_2include_2opencv2_2cudev_2warp_2scan_8hpp.html',1,'(Global Namespace)']]], - ['scan_5fis_129',['scan_is',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ad6c3f07029e022d82a459a12693fab50',1,'__ctype_abstract_base< wchar_t >::scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ad6c3f07029e022d82a459a12693fab50',1,'std::__ctype_abstract_base::scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ad6c3f07029e022d82a459a12693fab50',1,'std::ctype::scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#afb41b267fdd60faf7e4083606cb52a37',1,'std::ctype< char >::scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ad6c3f07029e022d82a459a12693fab50',1,'std::ctype< wchar_t >::scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ad6c3f07029e022d82a459a12693fab50',1,'std::ctype_byname::scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#afb41b267fdd60faf7e4083606cb52a37',1,'std::ctype_byname< char >::scan_is()']]], - ['scan_5fnot_130',['scan_not',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a083176729448869cdc7b5353299efac8',1,'__ctype_abstract_base< wchar_t >::scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a083176729448869cdc7b5353299efac8',1,'std::__ctype_abstract_base::scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a083176729448869cdc7b5353299efac8',1,'std::ctype::scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a8dface426b4233def1221b870319be44',1,'std::ctype< char >::scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a083176729448869cdc7b5353299efac8',1,'std::ctype< wchar_t >::scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a083176729448869cdc7b5353299efac8',1,'std::ctype_byname::scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a8dface426b4233def1221b870319be44',1,'std::ctype_byname< char >::scan_not()']]], - ['scanattr_131',['scanAttr',['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#ab0ef57b89bea5f94f7c343d2927a5acf',1,'cv::CvHaarFeatureParams::scanAttr()'],['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html#a1ff83b521ef1c8d5a83cd9fed4a89507',1,'cv::CvParams::scanAttr()']]], - ['scans_132',['SCANS',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a114713924ec05a0309f4df7e918c0324ac706a6a118a4a648fef8b2fca5950e2a',1,'cv::Stitcher']]], - ['scene_20reconstruction_133',['Scene Reconstruction',['https://docs.opencv.org/4.2.0/d4/d18/tutorial_sfm_scene_reconstruction.html',1,'']]], - ['scene_20text_20detection_134',['Scene Text Detection',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html',1,'']]], - ['scene_20text_20detection_20and_20recognition_135',['Scene Text Detection and Recognition',['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'']]], - ['scene_20text_20recognition_136',['Scene Text Recognition',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html',1,'']]], - ['scene_5faa_137',['SCENE_AA',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa4ff02bb7514152d154973ad7a061b756',1,'cv::ovis::SCENE_AA'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa4ff02bb7514152d154973ad7a061b756',1,'SCENE_AA(Global Namespace)']]], - ['scene_5finteractive_138',['SCENE_INTERACTIVE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aac3ceb82a09722fe7259f41e4c5a703d5',1,'cv::ovis::SCENE_INTERACTIVE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aac3ceb82a09722fe7259f41e4c5a703d5',1,'SCENE_INTERACTIVE(Global Namespace)']]], - ['scene_5foffscreen_139',['SCENE_OFFSCREEN',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa734b0f1d8ccd553b8a441214d673a996',1,'cv::ovis::SCENE_OFFSCREEN'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa734b0f1d8ccd553b8a441214d673a996',1,'SCENE_OFFSCREEN(Global Namespace)']]], - ['scene_5fsample_5fstep_140',['scene_sample_step',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a78629ddfb88fad7b33dd422ad7e4694d',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['scene_5fseparate_141',['SCENE_SEPARATE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa74b79923ba6b1b014585efe98a307e67',1,'cv::ovis::SCENE_SEPARATE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa74b79923ba6b1b014585efe98a307e67',1,'SCENE_SEPARATE(Global Namespace)']]], - ['scene_5fshow_5fcs_5fcross_142',['SCENE_SHOW_CS_CROSS',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa92776131bdb1f35563415df44da054e9',1,'cv::ovis::SCENE_SHOW_CS_CROSS'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa92776131bdb1f35563415df44da054e9',1,'SCENE_SHOW_CS_CROSS(Global Namespace)']]], - ['scenesettings_143',['SceneSettings',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gab053860632281ae40811362b337b564a',1,'cv::ovis::SceneSettings'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gab053860632281ae40811362b337b564a',1,'SceneSettings(Global Namespace)']]], - ['schar_144',['schar',['https://docs.opencv.org/4.2.0/d1/d1b/group__core__hal__interface.html#ga0fd9ce9d735064461bebfe6037026093',1,]]], - ['scharr_145',['Scharr',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaa13106761eedf14798f37aa2d60404c9',1,'cv::Scharr()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaa13106761eedf14798f37aa2d60404c9',1,'Scharr()(Global Namespace)']]], - ['scharrx_5f_146',['scharrX_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f5120386a720e7582fb641f76e0d63e',1,'cv::cudev::scharrX_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f5120386a720e7582fb641f76e0d63e',1,'scharrX_()(Global Namespace)']]], - ['scharrxptr_147',['ScharrXPtr',['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1ScharrXPtr.html',1,'cv::cudev']]], - ['scharrxptr_148',['scharrXPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4ccc106934145cb8ad4d08c284c22d',1,'cv::cudev::scharrXPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4ccc106934145cb8ad4d08c284c22d',1,'scharrXPtr()(Global Namespace)']]], - ['scharrxptrsz_149',['ScharrXPtrSz',['https://docs.opencv.org/4.2.0/d2/d88/structcv_1_1cudev_1_1ScharrXPtrSz.html',1,'cv::cudev']]], - ['scharry_5f_150',['scharrY_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9132e741aae381582a25b9a989c9efea',1,'cv::cudev::scharrY_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9132e741aae381582a25b9a989c9efea',1,'scharrY_()(Global Namespace)']]], - ['scharryptr_151',['ScharrYPtr',['https://docs.opencv.org/4.2.0/d0/d70/structcv_1_1cudev_1_1ScharrYPtr.html',1,'cv::cudev']]], - ['scharryptr_152',['scharrYPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97a29ac775cd5fa765344be1738a51e1',1,'cv::cudev::scharrYPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97a29ac775cd5fa765344be1738a51e1',1,'scharrYPtr()(Global Namespace)']]], - ['scharryptrsz_153',['ScharrYPtrSz',['https://docs.opencv.org/4.2.0/dd/def/structcv_1_1cudev_1_1ScharrYPtrSz.html',1,'cv::cudev']]], - ['schedule_20your_20network_20for_20halide_20backend_154',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], - ['scheduleevent_155',['scheduleEvent',['../classutil_1_1PeriodicScheduler.html#abb81bec9a351199c3430515e8302ba62',1,'util::PeriodicScheduler']]], - ['scheduletelemetrypull_156',['scheduleTelemetryPull',['../namespacecan.html#a60a17e1ae5b26cd35f4322028435b6cc',1,'can']]], - ['scientific_157',['scientific',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'basic_ios< char, _Traits >::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'basic_iostream< char >::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'basic_istream< char >::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'basic_istream< char, _Traits >::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'basic_ostream< char >::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'basic_ostream< char, _Traits >::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_fstream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_ifstream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_ios::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_iostream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_istream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_istringstream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_ofstream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_ostream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_ostringstream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_stringstream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::ios_base::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a3286bebdde076d132d35c8fc79d6bdc4',1,'std::scientific()']]], - ['scoped_5fallocator_158',['scoped_allocator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00131.html',1,'']]], - ['scoped_5fallocator_5fadaptor_159',['scoped_allocator_adaptor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02747.html',1,'std']]], - ['scoped_5fallocator_5fadaptor_3c_20_5finnerhead_2c_20_5finnertail_2e_2e_2e_20_3e_160',['scoped_allocator_adaptor< _InnerHead, _InnerTail... >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02747.html',1,'']]], - ['scopedtimer_161',['ScopedTimer',['../classutil_1_1ScopedTimer.html',1,'util::ScopedTimer'],['../classutil_1_1ScopedTimer.html#a8a81591c83834cbb2e676172dd12d122',1,'util::ScopedTimer::ScopedTimer(std::string name)'],['../classutil_1_1ScopedTimer.html#a74471e10bbfdba342fe8e94131915349',1,'util::ScopedTimer::ScopedTimer()']]], - ['score_162',['score',['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1ximgproc_1_1Box.html#a087d310d7a7f472bc9540017a3ee49ee',1,'cv::ximgproc::Box::score'],['https://docs.opencv.org/4.2.0/df/da3/structcv_1_1linemod_1_1QuantizedPyramid_1_1Candidate.html#afbac5d07850cb1d7fc6f09cb2d09ffdf',1,'cv::linemod::QuantizedPyramid::Candidate::score'],['https://docs.opencv.org/4.2.0/d7/de4/structcv_1_1dpm_1_1DPMDetector_1_1ObjectDetection.html#a7dcc51aa5b6d36624cac2932bb284694',1,'cv::dpm::DPMDetector::ObjectDetection::score']]], - ['scoretype_163',['ScoreType',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a5f63b20f3802ea09319a934b353303e7',1,'cv::ORB']]], - ['scratch_5fhelper_164',['scratch_helper',['https://docs.opencv.org/4.2.0/db/df4/structcv_1_1detail_1_1scratch__helper.html',1,'cv::detail']]], - ['scratch_5fhelper_3c_20false_2c_20impl_2c_20ins_2e_2e_2e_20_3e_165',['scratch_helper< false, Impl, Ins... >',['https://docs.opencv.org/4.2.0/d0/d94/structcv_1_1detail_1_1scratch__helper_3_01false_00_01Impl_00_01Ins_8_8_8_01_4.html',1,'cv::detail']]], - ['scratch_5fhelper_3c_20true_2c_20impl_2c_20ins_2e_2e_2e_20_3e_166',['scratch_helper< true, Impl, Ins... >',['https://docs.opencv.org/4.2.0/dd/d8e/structcv_1_1detail_1_1scratch__helper_3_01true_00_01Impl_00_01Ins_8_8_8_01_4.html',1,'cv::detail']]], - ['sdk_167',['OpenCV4Android SDK',['https://docs.opencv.org/4.2.0/da/d2a/tutorial_O4A_SDK.html',1,'']]], - ['sdk_20compatible_20depth_20sensors_168',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], - ['seam_20estimation_169',['Seam Estimation',['https://docs.opencv.org/4.2.0/d9/d24/group__stitching__seam.html',1,'']]], - ['seam_5ffinders_2ehpp_170',['seam_finders.hpp',['https://docs.opencv.org/4.2.0/d1/d74/seam__finders_8hpp.html',1,'']]], - ['seamestimationresol_171',['seamEstimationResol',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ac559c3eb228614f9402ff3eba23a08f5',1,'cv::Stitcher']]], - ['seamfinder_172',['SeamFinder',['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html',1,'cv::detail']]], - ['seamfinder_173',['seamFinder',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a380c7c920f59047f2b25de7dc86f563d',1,'cv::Stitcher::seamFinder()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a850ad8689b42b43e10f8f45c39b0f797',1,'cv::Stitcher::seamFinder() const']]], - ['seamless_20cloning_174',['Seamless Cloning',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html',1,'']]], - ['seamlessclone_175',['seamlessClone',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#ga2bf426e4c93a6b1f21705513dfeca49d',1,'cv::seamlessClone()'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#ga2bf426e4c93a6b1f21705513dfeca49d',1,'seamlessClone(InputArray src, InputArray dst, InputArray mask, Point p, OutputArray blend, int flags)(Global Namespace)']]], - ['search_176',['Binary Search',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html',1,'']]], - ['search_177',['search',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga37e40c12374da3b76f2af5d2025b3018',1,'std::search(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gab76055789d1a598394f609cf19724220',1,'std::search(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2, _BinaryPredicate __predicate)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga37e40c12374da3b76f2af5d2025b3018',1,'search(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gab76055789d1a598394f609cf19724220',1,'search(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2, _BinaryPredicate __predicate)(Global Namespace)']]], - ['search_20in_20multi_20dimensional_20spaces_178',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], - ['search_2eh_179',['search.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00962.html',1,'']]], - ['search_5fminimal_5fn_180',['search_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a0a323f305cb24d5c555e35031553ef02',1,'__gnu_parallel::_Settings']]], - ['search_5fn_181',['search_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga98baadb721fcb143396118e3a678cd0e',1,'std::search_n(_ForwardIterator __first, _ForwardIterator __last, _Integer __count, const _Tp &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga4fd2241c480f56cb4fef2ae7da4d36b0',1,'std::search_n(_ForwardIterator __first, _ForwardIterator __last, _Integer __count, const _Tp &__val, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga98baadb721fcb143396118e3a678cd0e',1,'search_n(_ForwardIterator __first, _ForwardIterator __last, _Integer __count, const _Tp &__val)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga4fd2241c480f56cb4fef2ae7da4d36b0',1,'search_n(_ForwardIterator __first, _ForwardIterator __last, _Integer __count, const _Tp &__val, _BinaryPredicate __binary_pred)(Global Namespace)']]], - ['searchfactor_182',['searchFactor',['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html#aa9770acf6b2627cc66ae2a182f054937',1,'cv::TrackerSamplerCS::Params']]], - ['searchparams_183',['searchParams',['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#af7f49c47216e18e7bdbefeb73884b891',1,'cv::FlannBasedMatcher']]], - ['searchwinsize_184',['searchWinSize',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a1a0afdd15fab339b4c14379420c46e0e',1,'cv::TrackerSamplerCSC::Params']]], - ['second_185',['second',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'__gnu_parallel::_IteratorPair::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< _Bi_iter, _Bi_iter >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< _BiIter, _BiIter >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< _Iterator1, _Iterator2 >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< _RAIter, _RAIter >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< char, _TokenT >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< char, char >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< entry_pointer, typename _Alloc::size_type >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'std::pair::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'std::sub_match::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'sub_match< _Bi_iter >::second']]], - ['second_5fargument_5ftype_186',['second_argument_type',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'cv::cudev::binary_function::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< double, double, double >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< float, float, float >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< Predicate::first_argument_type, Predicate::second_argument_type, Predicate::result_type >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< schar, schar, float >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< schar, schar, schar >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< short, short, float >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< short, short, short >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< T1, T2, T1 >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< T1, T2, T2 >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< uchar, uchar, float >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< uchar, uchar, uchar >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< uint, uint, float >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< uint, uint, uint >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< ushort, ushort, float >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< ushort, ushort, ushort >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_cxx::project1st::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_cxx::project2nd::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_EqualFromLess::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_EqualTo::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_Less::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_Lexicographic::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_LexicographicReverse::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_Multiplies::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_Plus::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< __shared_ptr< _Tp, _Lp >, __shared_ptr< _Tp, _Lp >, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< __weak_ptr< _Tp, _Lp >, __weak_ptr< _Tp, _Lp >, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Arg1, _Arg2, _Arg1 >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Arg1, _Arg2, _Arg2 >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Predicate::first_argument_type, _Predicate::second_argument_type, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _T1, _T2, _Res >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _T1, _T2, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Tp *, _Arg, _Ret >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Tp *, _Tp *, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Tp, _Arg, _Ret >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Tp, _Tp, _Tp >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Tp, _Tp, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Tp1, _Tp2, _Result >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< const _Tp *, _Arg, _Ret >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< rope< _CharT, _Alloc >, rope< _CharT, _Alloc >, rope< _CharT, _Alloc > >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< shared_ptr< _Tp >, shared_ptr< _Tp >, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< std::pair< _T1, _T2 >, std::pair< _T1, _T2 >, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< value_type, value_type, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< void, void, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< weak_ptr< _Tp >, weak_ptr< _Tp >, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::_Maybe_unary_or_binary_function< _Res, _T1, _T2 >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::binary_function::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::binary_negate::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::const_mem_fun1_ref_t::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::const_mem_fun1_t::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::divides::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::equal_to::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::experimental::fundamentals_v2::owner_less< shared_ptr< _Tp > >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::experimental::fundamentals_v2::owner_less< weak_ptr< _Tp > >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::greater::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::greater_equal::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::less::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::less_equal::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::logical_and::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::logical_or::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::mem_fun1_ref_t::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::mem_fun1_t::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::minus::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::modulus::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::multiplies::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::not_equal_to::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::owner_less< shared_ptr< _Tp > >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::owner_less< void >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::owner_less< weak_ptr< _Tp > >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::plus::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::pointer_to_binary_function::second_argument_type']]], - ['second_5ftype_187',['second_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'__gnu_parallel::_IteratorPair::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< _Bi_iter, _Bi_iter >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< _BiIter, _BiIter >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< _Iterator1, _Iterator2 >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< _RAIter, _RAIter >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< char, _TokenT >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< char, char >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< entry_pointer, typename _Alloc::size_type >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'std::pair::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'std::sub_match::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'sub_match< _Bi_iter >::second_type']]], - ['seconds_188',['seconds',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#a8ea2b45186343bcb86404b30815edf69',1,'std::chrono']]], - ['sectionnames_189',['sectionNames',['https://docs.opencv.org/4.2.0/db/dc1/group__datasets__track.html#gaae90bc58a7dfcdb4042a445d259e576b',1,'cv::datasets::sectionNames'],['https://docs.opencv.org/4.2.0/db/dc1/group__datasets__track.html#gaae90bc58a7dfcdb4042a445d259e576b',1,'sectionNames(Global Namespace)']]], - ['sectionsizes_190',['sectionSizes',['https://docs.opencv.org/4.2.0/db/dc1/group__datasets__track.html#ga19321b112ab3487fe3bd6ca88ae245e0',1,'cv::datasets::sectionSizes'],['https://docs.opencv.org/4.2.0/db/dc1/group__datasets__track.html#ga19321b112ab3487fe3bd6ca88ae245e0',1,'sectionSizes(Global Namespace)']]], - ['seed_191',['seed',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#adb96894164392bcd56297e52b2913e21',1,'cv::face::FacemarkLBF::Params::seed'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a11e6426e20d3ed617cf8fea9c3d7d2cf',1,'cv::RNG_MT19937::seed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a271b3af14e42c8d2eb9df443916b3e84',1,'std::discard_block_engine::seed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a0bbf8d919762d77cdb63f350a77c3853',1,'std::discard_block_engine::seed(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a03e7c33b907217f52a22d855b8f046d1',1,'std::discard_block_engine::seed(_Sseq &__q)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a68700cdbf6e7f53faa2cf86baf96d142',1,'std::independent_bits_engine::seed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a9d04c347df4ab52e8c1b8e6ab3a547de',1,'std::independent_bits_engine::seed(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a53bb5f059979eea1988908f2d767323e',1,'std::independent_bits_engine::seed(_Sseq &__q)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a7ef79cd68e42013fb35269be5d130797',1,'std::linear_congruential_engine::seed(_Sseq &__q) -> _If_seed_seq< _Sseq >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#aa0c9986cf366682ff3311bca8021ee19',1,'std::linear_congruential_engine::seed(result_type __s=default_seed)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#aac948b8fbdb3540985f0e23ff984ef3c',1,'std::linear_congruential_engine::seed(_Sseq &__q)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a6694efb9e8aeb7591edfa921d9b9b660',1,'std::shuffle_order_engine::seed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#ae8b8fd06503a7059d60289378438f9d2',1,'std::shuffle_order_engine::seed(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a2a6b36b00d80a1444a393cb4db444c2a',1,'std::shuffle_order_engine::seed(_Sseq &__q)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a5629eb85bb95f545575b9b08bacafda4',1,'std::subtract_with_carry_engine::seed(result_type __sd=default_seed)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#ab547f8ba4458122672f929f3fef4026c',1,'std::subtract_with_carry_engine::seed(_Sseq &__q)']]], - ['seed_5fseq_192',['seed_seq',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06515.html',1,'std::seed_seq'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06515.html#a125513e09d016c8a95dba3ce653c8001',1,'std::seed_seq::seed_seq()']]], - ['seeds_2ehpp_193',['seeds.hpp',['https://docs.opencv.org/4.2.0/d5/daf/seeds_8hpp.html',1,'']]], - ['seek_194',['seek',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ab4528351272b931dfc8d471c50ea1115',1,'cv::MatConstIterator::seek(ptrdiff_t ofs, bool relative=false)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#acf82c2ab7fe9e81961db497909cee953',1,'cv::MatConstIterator::seek(const int *_idx, bool relative=false)']]], - ['seekdir_195',['seekdir',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'basic_ios< char, _Traits >::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'basic_iostream< char >::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'basic_istream< char >::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'basic_istream< char, _Traits >::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'basic_ostream< char >::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'basic_ostream< char, _Traits >::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_fstream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_ifstream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_ios::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_iostream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_istream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_istringstream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_ofstream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_ostream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_ostringstream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_stringstream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::ios_base::seekdir']]], - ['seekend_196',['seekEnd',['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ad6e372a9006ca9a8838825a6ac98b45d',1,'cv::SparseMatConstIterator']]], - ['seekg_197',['seekg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'basic_iostream< char >::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'basic_iostream< char >::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'basic_iostream< char >::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'basic_iostream< char >::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'basic_istream< char >::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'basic_istream< char >::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'basic_istream< char >::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'basic_istream< char >::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'basic_istream< char, _Traits >::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'basic_istream< char, _Traits >::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'basic_istream< char, _Traits >::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'basic_istream< char, _Traits >::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_fstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_fstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_fstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_fstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_ifstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_ifstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_ifstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_ifstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_iostream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_iostream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_iostream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_iostream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_istream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_istream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_istream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_istream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_istringstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_istringstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_istringstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_istringstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_stringstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_stringstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_stringstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_stringstream::seekg(off_type, ios_base::seekdir)']]], - ['seekoff_198',['seekoff',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0152beebcac8c9542b6b0efe3de5bbfb',1,'__gnu_cxx::enc_filebuf::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0152beebcac8c9542b6b0efe3de5bbfb',1,'__gnu_cxx::stdio_filebuf::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad6d5177e376efdb0dccf62890eebc9b0',1,'__gnu_cxx::stdio_sync_filebuf::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0152beebcac8c9542b6b0efe3de5bbfb',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0152beebcac8c9542b6b0efe3de5bbfb',1,'basic_filebuf< char_type, traits_type >::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad6d5177e376efdb0dccf62890eebc9b0',1,'basic_streambuf< _Elem, _Tr >::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad6d5177e376efdb0dccf62890eebc9b0',1,'basic_streambuf< char, _Traits >::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad6d5177e376efdb0dccf62890eebc9b0',1,'basic_streambuf< char, char_traits< char > >::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0152beebcac8c9542b6b0efe3de5bbfb',1,'std::basic_filebuf::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad6d5177e376efdb0dccf62890eebc9b0',1,'std::basic_streambuf::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a87ffed7ed9940e5952303b31be0b6a11',1,'std::basic_stringbuf::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad6d5177e376efdb0dccf62890eebc9b0',1,'std::wbuffer_convert::seekoff()']]], - ['seekp_199',['seekp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'basic_iostream< char >::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'basic_iostream< char >::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'basic_ostream< char >::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'basic_ostream< char >::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'basic_ostream< char, _Traits >::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'basic_ostream< char, _Traits >::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'std::basic_fstream::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'std::basic_fstream::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'std::basic_iostream::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'std::basic_iostream::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'std::basic_ofstream::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'std::basic_ofstream::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'std::basic_ostream::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'std::basic_ostream::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'std::basic_ostringstream::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'std::basic_ostringstream::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'std::basic_stringstream::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'std::basic_stringstream::seekp(off_type, ios_base::seekdir)']]], - ['seekpos_200',['seekpos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a91365d684bb298cb7ad42e3c73cd0252',1,'__gnu_cxx::enc_filebuf::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a91365d684bb298cb7ad42e3c73cd0252',1,'__gnu_cxx::stdio_filebuf::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a008405d586f640e109c7ab7bf424aa39',1,'__gnu_cxx::stdio_sync_filebuf::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a91365d684bb298cb7ad42e3c73cd0252',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a91365d684bb298cb7ad42e3c73cd0252',1,'basic_filebuf< char_type, traits_type >::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a008405d586f640e109c7ab7bf424aa39',1,'basic_streambuf< _Elem, _Tr >::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a008405d586f640e109c7ab7bf424aa39',1,'basic_streambuf< char, _Traits >::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a008405d586f640e109c7ab7bf424aa39',1,'basic_streambuf< char, char_traits< char > >::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a91365d684bb298cb7ad42e3c73cd0252',1,'std::basic_filebuf::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a008405d586f640e109c7ab7bf424aa39',1,'std::basic_streambuf::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a763bee40dfc04e2ee2816e322c3af297',1,'std::basic_stringbuf::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a008405d586f640e109c7ab7bf424aa39',1,'std::wbuffer_convert::seekpos()']]], - ['segment_201',['segment',['https://docs.opencv.org/4.2.0/da/dce/classcv_1_1dnn_1_1SegmentationModel.html#ab5542c90d35cfbc3fa32095aa77b2a95',1,'cv::dnn::SegmentationModel']]], - ['segmentation_202',['Segmentation',['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html',1,'Background Segmentation'],['https://docs.opencv.org/4.2.0/dc/d29/group__hfs.html',1,'Hierarchical Feature Selection for Efficient Image Segmentation'],['https://docs.opencv.org/4.2.0/d3/d2d/group__datasets__is.html',1,'Image Segmentation']]], - ['segmentation_203',['Image segmentation',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html',1,'']]], - ['segmentation_20by_20a_20gradient_20structure_20tensor_204',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], - ['segmentation_20methods_205',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], - ['segmentation_20on_20g_20api_206',['Porting anisotropic image segmentation on G-API',['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'']]], - ['segmentation_20with_20distance_20transform_20and_20watershed_20algorithm_207',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], - ['segmentation_20with_20watershed_20algorithm_208',['Segmentation with Watershed Algorithm',['https://docs.opencv.org/4.2.0/d3/db4/tutorial_py_watershed.html',1,'Image Segmentation with Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d7/d1c/tutorial_js_watershed.html',1,'Image Segmentation with Watershed Algorithm']]], - ['segmentation_2ehpp_209',['segmentation.hpp',['https://docs.opencv.org/4.2.0/dc/dd0/segmentation_8hpp.html',1,'']]], - ['segmentationmodel_210',['SegmentationModel',['https://docs.opencv.org/4.2.0/da/dce/classcv_1_1dnn_1_1SegmentationModel.html',1,'cv::dnn::SegmentationModel'],['https://docs.opencv.org/4.2.0/da/dce/classcv_1_1dnn_1_1SegmentationModel.html#ae4f2c95310ea7213bb6b889160e21fd7',1,'cv::dnn::SegmentationModel::SegmentationModel(const String &model, const String &config="")'],['https://docs.opencv.org/4.2.0/da/dce/classcv_1_1dnn_1_1SegmentationModel.html#a972b1ee7ce7694b2fe3b6db3bf6f6a29',1,'cv::dnn::SegmentationModel::SegmentationModel(const Net &network)']]], - ['segmentationparameters_211',['SegmentationParameters',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html',1,'cv::bioinspired::SegmentationParameters'],['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#accbb5b7e2ada944a4c14d1077599484d',1,'cv::bioinspired::SegmentationParameters::SegmentationParameters()']]], - ['segmentmotion_212',['segmentMotion',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga9eea50c233a0a6d7fecdd2c66821eed5',1,'cv::motempl::segmentMotion()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga9eea50c233a0a6d7fecdd2c66821eed5',1,'segmentMotion()(Global Namespace)']]], - ['select_213',['Select',['https://eigen.tuxfamily.org/dox/classEigen_1_1Select.html',1,'Eigen']]], - ['select_214',['select',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65e78cfcbc9852e6923bebff4323ddca',1,'Eigen::DenseBase::select(const DenseBase< ThenDerived > &thenMatrix, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a57ef09a843004095f84c198dd145641b',1,'Eigen::DenseBase::select(const DenseBase< ThenDerived > &thenMatrix, const typename ThenDerived::Scalar &elseScalar) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e8e78c75887d4539071a0b7a61ca103',1,'Eigen::DenseBase::select(const typename ElseDerived::Scalar &thenScalar, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65e78cfcbc9852e6923bebff4323ddca',1,'DenseBase< ArrayWrapper< ExpressionType > >::select(const DenseBase< ThenDerived > &thenMatrix, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a57ef09a843004095f84c198dd145641b',1,'DenseBase< ArrayWrapper< ExpressionType > >::select(const DenseBase< ThenDerived > &thenMatrix, const typename ThenDerived::Scalar &elseScalar) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e8e78c75887d4539071a0b7a61ca103',1,'DenseBase< ArrayWrapper< ExpressionType > >::select(const typename ElseDerived::Scalar &thenScalar, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65e78cfcbc9852e6923bebff4323ddca',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::select(const DenseBase< ThenDerived > &thenMatrix, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a57ef09a843004095f84c198dd145641b',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::select(const DenseBase< ThenDerived > &thenMatrix, const typename ThenDerived::Scalar &elseScalar) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e8e78c75887d4539071a0b7a61ca103',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::select(const typename ElseDerived::Scalar &thenScalar, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65e78cfcbc9852e6923bebff4323ddca',1,'DenseBase< Solve< Decomposition, RhsType > >::select(const DenseBase< ThenDerived > &thenMatrix, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a57ef09a843004095f84c198dd145641b',1,'DenseBase< Solve< Decomposition, RhsType > >::select(const DenseBase< ThenDerived > &thenMatrix, const typename ThenDerived::Scalar &elseScalar) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e8e78c75887d4539071a0b7a61ca103',1,'DenseBase< Solve< Decomposition, RhsType > >::select(const typename ElseDerived::Scalar &thenScalar, const DenseBase< ElseDerived > &elseMatrix) const'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga41ca710c7c457ecc8b32b5a3d9f12634',1,'cv::gapi::select()'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga41ca710c7c457ecc8b32b5a3d9f12634',1,'select()(Global Namespace)']]], - ['select1st_215',['select1st',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09171.html',1,'__gnu_cxx']]], - ['select2nd_216',['select2nd',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09175.html',1,'__gnu_cxx']]], - ['select_5fkeyframes_217',['select_keyframes',['https://docs.opencv.org/4.2.0/d1/d61/classcv_1_1sfm_1_1libmv__ReconstructionOptions.html#a1f7fae6ec918e2b1fb94b122aeb1cb9d',1,'cv::sfm::libmv_ReconstructionOptions']]], - ['select_5fon_5fcontainer_5fcopy_5fconstruction_218',['select_on_container_copy_construction',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ac324d9065f45f7ae2dd1e0014c73f218',1,'__alloc_traits< _Tp_alloc_type >::select_on_container_copy_construction()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ac324d9065f45f7ae2dd1e0014c73f218',1,'__gnu_cxx::__alloc_traits::select_on_container_copy_construction()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ac324d9065f45f7ae2dd1e0014c73f218',1,'allocator_traits< _Tp_alloc_type >::select_on_container_copy_construction()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ac324d9065f45f7ae2dd1e0014c73f218',1,'std::allocator_traits::select_on_container_copy_construction()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#abba21b363dcc1a741ea3f6047e491388',1,'std::allocator_traits< allocator< _Tp > >::select_on_container_copy_construction()']]], - ['selectbestclassifier_219',['selectBestClassifier',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html#a971d1b4ec5c65f3ac729ce3bb70f053b',1,'cv::BaseClassifier']]], - ['selectif_220',['SelectIf',['https://docs.opencv.org/4.2.0/d8/d1b/structcv_1_1cudev_1_1SelectIf.html',1,'cv::cudev']]], - ['selectif_3c_20false_2c_20thentype_2c_20elsetype_20_3e_221',['SelectIf< false, ThenType, ElseType >',['https://docs.opencv.org/4.2.0/dd/da7/structcv_1_1cudev_1_1SelectIf_3_01false_00_01ThenType_00_01ElseType_01_4.html',1,'cv::cudev']]], - ['selection_222',['selection',['https://docs.opencv.org/4.2.0/d7/da2/classcv_1_1TrackerFeature.html#af07aacc3c887382f5ad72c2f38dcb5a8',1,'cv::TrackerFeature::selection()'],['https://docs.opencv.org/4.2.0/d3/d4c/classcv_1_1TrackerFeatureFeature2d.html#aa46c143187e3f40c75bbf8f61c207a98',1,'cv::TrackerFeatureFeature2d::selection()'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a68a590ce3590ca57b29a3d17db81d7d9',1,'cv::TrackerFeatureHAAR::selection()'],['https://docs.opencv.org/4.2.0/d2/da3/classcv_1_1TrackerFeatureHOG.html#af054f2d656b3d4f36b7b880629e64dc7',1,'cv::TrackerFeatureHOG::selection()'],['https://docs.opencv.org/4.2.0/dc/d73/classcv_1_1TrackerFeatureLBP.html#a5e3654d875f90a2ea8489037ea3fe135',1,'cv::TrackerFeatureLBP::selection()'],['https://docs.opencv.org/4.2.0/dc/da7/classcv_1_1TrackerFeatureSet.html#aa770a9d343671844657077cb79dba235',1,'cv::TrackerFeatureSet::selection()']]], - ['selection_20for_20efficient_20image_20segmentation_223',['Hierarchical Feature Selection for Efficient Image Segmentation',['https://docs.opencv.org/4.2.0/dc/d29/group__hfs.html',1,'']]], - ['selectivesearchsegmentation_224',['SelectiveSearchSegmentation',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html',1,'cv::ximgproc::segmentation']]], - ['selectivesearchsegmentationstrategy_225',['SelectiveSearchSegmentationStrategy',['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategy.html',1,'cv::ximgproc::segmentation']]], - ['selectivesearchsegmentationstrategycolor_226',['SelectiveSearchSegmentationStrategyColor',['https://docs.opencv.org/4.2.0/de/dab/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategyColor.html',1,'cv::ximgproc::segmentation']]], - ['selectivesearchsegmentationstrategyfill_227',['SelectiveSearchSegmentationStrategyFill',['https://docs.opencv.org/4.2.0/d9/db3/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategyFill.html',1,'cv::ximgproc::segmentation']]], - ['selectivesearchsegmentationstrategymultiple_228',['SelectiveSearchSegmentationStrategyMultiple',['https://docs.opencv.org/4.2.0/d8/d8e/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategyMultiple.html',1,'cv::ximgproc::segmentation']]], - ['selectivesearchsegmentationstrategysize_229',['SelectiveSearchSegmentationStrategySize',['https://docs.opencv.org/4.2.0/d0/d10/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategySize.html',1,'cv::ximgproc::segmentation']]], - ['selectivesearchsegmentationstrategytexture_230',['SelectiveSearchSegmentationStrategyTexture',['https://docs.opencv.org/4.2.0/d6/d17/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategyTexture.html',1,'cv::ximgproc::segmentation']]], - ['selectrandomsubset_231',['selectRandomSubset',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga73d6882563516f276bda76365d4619ee',1,'cv::detail::selectRandomSubset()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga73d6882563516f276bda76365d4619ee',1,'selectRandomSubset()(Global Namespace)']]], - ['selectroi_232',['selectROI',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8daf4730d3adf7035b6de9be4c469af5',1,'cv::selectROI(const String &windowName, InputArray img, bool showCrosshair=true, bool fromCenter=false)'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga2e2256794d0c88f4cfc4fdd7890c9794',1,'cv::selectROI(InputArray img, bool showCrosshair=true, bool fromCenter=false)'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8daf4730d3adf7035b6de9be4c469af5',1,'selectROI(const String &windowName, InputArray img, bool showCrosshair=true, bool fromCenter=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga2e2256794d0c88f4cfc4fdd7890c9794',1,'selectROI(InputArray img, bool showCrosshair=true, bool fromCenter=false)(Global Namespace)']]], - ['selectrois_233',['selectROIs',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga0f11fad74a6432b8055fb21621a0f893',1,'cv::selectROIs()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga0f11fad74a6432b8055fb21621a0f893',1,'selectROIs()(Global Namespace)']]], - ['selectscatteredfeatures_234',['selectScatteredFeatures',['https://docs.opencv.org/4.2.0/d7/d6f/classcv_1_1linemod_1_1QuantizedPyramid.html#a8c9546d287bf178f6aab3d8067066b2a',1,'cv::linemod::QuantizedPyramid']]], - ['selfadjoint_235',['SelfAdjoint',['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cdacf9ccb2016f8b9c0f3268f05a1e75821',1,'Eigen::SelfAdjoint'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cdacf9ccb2016f8b9c0f3268f05a1e75821',1,'SelfAdjoint(Global Namespace)']]], - ['selfadjointeigensolver_236',['SelfAdjointEigenSolver',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html',1,'Eigen::SelfAdjointEigenSolver< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a8f3dde67faa971dd97e8141617762326',1,'Eigen::SelfAdjointEigenSolver::SelfAdjointEigenSolver()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a7d8cba55cce60cb3931148208cc5bd0e',1,'Eigen::SelfAdjointEigenSolver::SelfAdjointEigenSolver(const EigenBase< InputType > &matrix, int options=ComputeEigenvectors)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a825919ee41153a19910c72d1bff31c8e',1,'Eigen::SelfAdjointEigenSolver::SelfAdjointEigenSolver(Index size)']]], - ['selfadjointview_237',['SelfAdjointView',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html',1,'Eigen']]], - ['selfadjointview_238',['selfadjointView',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad446541377593656c1399862fe6a0f94',1,'Eigen::MatrixBase::selfadjointView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a67eb836f331d9b567e7f36ec0782fa07',1,'Eigen::MatrixBase::selfadjointView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad446541377593656c1399862fe6a0f94',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::selfadjointView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a67eb836f331d9b567e7f36ec0782fa07',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::selfadjointView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad446541377593656c1399862fe6a0f94',1,'MatrixBase< Solve< Decomposition, RhsType > >::selfadjointView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a67eb836f331d9b567e7f36ec0782fa07',1,'MatrixBase< Solve< Decomposition, RhsType > >::selfadjointView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a408d1e6601f83ae8b7cd5edc8ad313a5',1,'Eigen::TriangularView::selfadjointView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a669d39567c1a2f805582c7538f2752b5',1,'Eigen::TriangularView::selfadjointView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a408d1e6601f83ae8b7cd5edc8ad313a5',1,'TriangularView< const Derived, Mode >::selfadjointView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a669d39567c1a2f805582c7538f2752b5',1,'TriangularView< const Derived, Mode >::selfadjointView() const']]], - ['selfadjointview_3c_20const_20derived_2c_20uplo_20_3e_239',['SelfAdjointView< const Derived, UpLo >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html',1,'']]], - ['sendcanpacket_240',['sendCANPacket',['../namespacecan.html#a3e4a4acc87fbf8cfad2a9a9252811314',1,'can']]], - ['sendjson_241',['sendJSON',['../classnet_1_1websocket_1_1SingleClientWSServer.html#a1c61e5d20850e351ee97760a0c65e13b',1,'net::websocket::SingleClientWSServer']]], - ['sendrawstring_242',['sendRawString',['../classnet_1_1websocket_1_1SingleClientWSServer.html#a96d029a7fcc48f6339b896ee17c64343',1,'net::websocket::SingleClientWSServer']]], - ['sensitivity_243',['sensitivity',['https://docs.opencv.org/4.2.0/df/d5b/classcv_1_1videostab_1_1WeightingDeblurer.html#a78287845b6cf7f6a3e3c9c6ce90d540c',1,'cv::videostab::WeightingDeblurer']]], - ['sensor_5ft_244',['sensor_t',['../structcan_1_1motor_1_1sensor__t.html',1,'can::motor']]], - ['sensors_245',['sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors'],['https://docs.opencv.org/4.2.0/d7/d6f/tutorial_kinect_openni.html',1,'Using Kinect and other OpenNI compatible depth sensors']]], - ['sentry_246',['sentry',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02491.html',1,'std::basic_istream< _CharT, _Traits >::sentry'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02639.html',1,'std::basic_ostream< _CharT, _Traits >::sentry'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02491.html#a2fc3c8f08453fb26ed43694eaeab5493',1,'std::basic_istream::sentry::sentry()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02639.html#ae972dd47564726ff41e6be700820719c',1,'std::basic_ostream::sentry::sentry()']]], - ['senz3d_20and_20other_20intel_20perceptual_20computing_20sdk_20compatible_20depth_20sensors_247',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], - ['separable_20data_248',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], - ['separatedetectionwork_249',['separateDetectionWork',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#aae0c0bd5a104bb1c57632e5187f32fe8',1,'cv::DetectionBasedTracker']]], - ['sepfilter_250',['sepFilter',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga546a47a68c08bb49bb40825780ffc2e8',1,'cv::gapi::sepFilter()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga546a47a68c08bb49bb40825780ffc2e8',1,'sepFilter()(Global Namespace)']]], - ['sepfilter2d_251',['sepFilter2D',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga910e29ff7d7b105057d1625a4bf6318d',1,'cv::sepFilter2D()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga9bc59a448bd61e38e0383daf1572b12d',1,'cv::hal::sepFilter2D()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga910e29ff7d7b105057d1625a4bf6318d',1,'sepFilter2D(InputArray src, OutputArray dst, int ddepth, InputArray kernelX, InputArray kernelY, Point anchor=Point(-1,-1), double delta=0, int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga9bc59a448bd61e38e0383daf1572b12d',1,'sepFilter2D(int stype, int dtype, int ktype, uchar *src_data, size_t src_step, uchar *dst_data, size_t dst_step, int width, int height, int full_width, int full_height, int offset_x, int offset_y, uchar *kernelx_data, int kernelx_len, uchar *kernely_data, int kernely_len, int anchor_x, int anchor_y, double delta, int borderType)(Global Namespace)']]], - ['seq_252',['SEQ',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45aa359c2282183738d11a665035a1a67bb',1,'cv::FileNode']]], - ['seq_253',['seq',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad87fbafd4a91f5c1ed6a768987a1b74d',1,'Eigen::seq(FirstType f, LastType l)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a0c04400203ca9b414e13c9c721399969',1,'Eigen::seq(FirstType f, LastType l, IncrType incr)']]], - ['seqn_254',['seqN',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ade9f918902511b83512a8e6dde5cad7a',1,'Eigen::seqN(FirstType first, SizeType size)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a3a3c346d2a61d1e8e86e6fb4cf57fbda',1,'Eigen::seqN(FirstType first, SizeType size, IncrType incr)']]], - ['sequence_5ftag_255',['sequence_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11211.html',1,'__gnu_pbds']]], - ['sequences_256',['Sequences',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01470.html',1,'']]], - ['sequential_257',['sequential',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a76f6cbf29b1b8d57762cce1ed9bd01a8a7e6aa054fd848be925726fcf7b4eb3ce',1,'__gnu_parallel']]], - ['sequential_5ftag_258',['sequential_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09703.html',1,'__gnu_parallel']]], - ['set_259',['set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08803.html',1,'std::__debug::set< _Key, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08939.html',1,'std::__profile::set< _Key, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html',1,'std::set< _Key, _Compare, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00134.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a97f006742147ad210284e401673d0887',1,'cv::DescriptorMatcher::DescriptorCollection::set()'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a1fa471fbcc4f193ac76ee42cbf3b9d6e',1,'cv::ocl::Device::set()'],['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html#accbd3f4f8ce6b4a04891a15683c58730',1,'cv::dnn::Dict::set()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a7d1878c70f71fa758d2a7e72944ae01b',1,'cv::ocl::Kernel::set(int i, const void *value, size_t sz)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a77a6c6c3b21e1b1a9259c541f88b48b7',1,'cv::ocl::Kernel::set(int i, const Image2D &image2D)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#aee13a6f7c087c5611048d97e4b833c56',1,'cv::ocl::Kernel::set(int i, const UMat &m)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a6130a2a2f7d6cc61c234c1f062630734',1,'cv::ocl::Kernel::set(int i, const KernelArg &arg)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#aff26198735930885f1f78e1990937475',1,'cv::ocl::Kernel::set(int i, const _Tp &value)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a8c6d8c2d37505b5ca61ffd4bb54e9a7c',1,'cv::VideoCapture::set()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a7ba668f440d8af5e1a92df58b2475816',1,'cv::VideoWriter::set()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ab8315853244a863923059790ac776299',1,'__gnu_parallel::_Settings::set()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a11172e92c3d43b0241294f0fabeb176c',1,'std::bitset::set() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a8e5de5f2693d0f873982c7e7435ecdb8',1,'std::bitset::set(size_t __position, bool __val=true)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a907d82d36716f9e488b991958f58f6aa',1,'std::set::set()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aed34d26628e845f2b7e0eb45959ef0fc',1,'std::set::set(const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a5c24e6efdb6526f5a28e7c54af8e3e15',1,'std::set::set(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a0b099bbbac6aef91b91c671c3e231979',1,'std::set::set(_InputIterator __first, _InputIterator __last, const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#adb05c13eee25271b092edf7878379cb5',1,'std::set::set(const set &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2ab389e91f3dc70a3e9a9e69067283ae',1,'std::set::set(set &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#acdf4b44f5a2f222c735237d763b89eaa',1,'std::set::set(initializer_list< value_type > __l, const _Compare &__comp=_Compare(), const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a943aa95cb4e637b9b3199cb63cd247b0',1,'std::set::set(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a06c8c1519399c9811fd0bfe2702f5c3b',1,'std::set::set(const set &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a5ef0930efbfe6211c06de5d4e4e7a253',1,'std::set::set(set &&__x, const allocator_type &__a) noexcept(is_nothrow_copy_constructible< _Compare >::value &&_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aaf9732d21b9343b12f3117fe3b87a6f3',1,'std::set::set(initializer_list< value_type > __l, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ac33c85b1fbf245c21fe0965b7e7eca59',1,'std::set::set(_InputIterator __first, _InputIterator __last, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#af0f0684a054caff643d9599dcc821b80',1,'std::tr2::dynamic_bitset::set()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a5d26ab2d19fd14a7a70c3d5af6b922be',1,'std::tr2::dynamic_bitset::set(size_type __pos, bool __val=true)']]], - ['set_20operations_260',['Set Operations',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html',1,'']]], - ['set16fprecision_261',['set16fPrecision',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#a90a0c3deed29ba559fa70d260e4d3030',1,'cv::Formatter']]], - ['set32fprecision_262',['set32fPrecision',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#aeab7d90ed6e65db4c9eb812db650154d',1,'cv::Formatter']]], - ['set64fprecision_263',['set64fPrecision',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#ad067f43e8dece00177a16214a561ddd1',1,'cv::Formatter']]], - ['set_5fargs_5f_264',['set_args_',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a247492daa0f3be7fe0265a1d19bb8597',1,'cv::ocl::Kernel::set_args_(int i, const _Tp0 &a0)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#ad756885d0824fd781064692a60697708',1,'cv::ocl::Kernel::set_args_(int i, const _Tp0 &a0, const _Tps &... rest_args)']]], - ['set_5fdifference_265',['set_difference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga35787a357982adc415c29c036f7aada7',1,'std::set_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga7cbebc70e1550ea9939c9269d7c7c289',1,'std::set_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga35787a357982adc415c29c036f7aada7',1,'set_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga7cbebc70e1550ea9939c9269d7c7c289',1,'set_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)(Global Namespace)']]], - ['set_5fdifference_5fminimal_5fn_266',['set_difference_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a5b63306dcd3a70e85dd42790b91aa0af',1,'__gnu_parallel::_Settings']]], - ['set_5fdistance_5ftype_267',['set_distance_type',['https://docs.opencv.org/4.2.0/dc/d8c/namespacecvflann.html#a9089240e70096e3b2ee3bec2b7f85c98',1,'cvflann']]], - ['set_5fgid_268',['set_gid',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145aea8f56585bae5bd29a5cb0d29767cccb',1,'set_gid(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145aea8f56585bae5bd29a5cb0d29767cccb',1,'set_gid(Global Namespace)']]], - ['set_5fintersection_269',['set_intersection',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#gad7a7b81513c68b856c0a2699c29532d0',1,'std::set_intersection(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga63b5280a2c5009456a51d38084ce1062',1,'std::set_intersection(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#gad7a7b81513c68b856c0a2699c29532d0',1,'set_intersection(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga63b5280a2c5009456a51d38084ce1062',1,'set_intersection(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)(Global Namespace)']]], - ['set_5fintersection_5fminimal_5fn_270',['set_intersection_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a397d3c431a2dc32de6e2eef4e7134b50',1,'__gnu_parallel::_Settings']]], - ['set_5fload_271',['set_load',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#acbe6814913bb7c30a34f4fc4d99d4e01',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger']]], - ['set_5floads_272',['set_loads',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11159.html#a5dba0dabb39ff7313a02f51b1bfefe24',1,'__gnu_pbds::hash_load_check_resize_trigger']]], - ['set_5fnew_5fhandler_273',['set_new_handler',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a08ab821429d6f9fd2f16f642de3e9163',1,'std']]], - ['set_5fnum_5fthreads_274',['set_num_threads',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::balanced_quicksort_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::balanced_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::default_parallel_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::exact_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::multiway_mergesort_exact_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::multiway_mergesort_sampling_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::multiway_mergesort_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::omp_loop_static_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::omp_loop_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::parallel_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::quicksort_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::sampling_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::unbalanced_tag::set_num_threads()']]], - ['set_5foperations_2eh_275',['set_operations.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00965.html',1,'']]], - ['set_5fsetpoint_276',['set_setpoint',['../classcontrol_1_1PlanarArmController.html#a1f7afb37e1c28f4c8fc15cc6d75ab4e0',1,'control::PlanarArmController']]], - ['set_5fsubtype_277',['set_subtype',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a63227e70c8b976fd6f65bb2d2d7dd021.html#a63227e70c8b976fd6f65bb2d2d7dd021',1,'nlohmann::byte_container_with_subtype']]], - ['set_5fsymmetric_5fdifference_278',['set_symmetric_difference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga3b7e12cbdb1a0d4e7691e9730e1924c5',1,'std::set_symmetric_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#gabd18017e018c3090eacd4509e28cc432',1,'std::set_symmetric_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga3b7e12cbdb1a0d4e7691e9730e1924c5',1,'set_symmetric_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#gabd18017e018c3090eacd4509e28cc432',1,'set_symmetric_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)(Global Namespace)']]], - ['set_5fsymmetric_5fdifference_5fminimal_5fn_279',['set_symmetric_difference_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#abf47bf2bbef9261d3d10b59558ddbdf2',1,'__gnu_parallel::_Settings']]], - ['set_5fterminate_280',['set_terminate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa53bcb9876c7b393a9e9e26fc90d5811',1,'std']]], - ['set_5fuid_281',['set_uid',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a2154ad8380cc7d3b920b3563078a50a8',1,'set_uid(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a2154ad8380cc7d3b920b3563078a50a8',1,'set_uid(Global Namespace)']]], - ['set_5funexpected_282',['set_unexpected',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a92329f10f9aba5eb5f26b11cf01d5166',1,'std']]], - ['set_5funion_283',['set_union',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga45c2e77ca73dabf6b1ccabbecf0291a6',1,'std::set_union(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga3d54d31bc70a0ff4596f5171ec728906',1,'std::set_union(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga45c2e77ca73dabf6b1ccabbecf0291a6',1,'set_union(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga3d54d31bc70a0ff4596f5171ec728906',1,'set_union(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)(Global Namespace)']]], - ['set_5funion_5fminimal_5fn_284',['set_union_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ab42faf337cfe7b64edfb7e61c6dadd08',1,'__gnu_parallel::_Settings']]], - ['set_5fx_5fvel_285',['set_x_vel',['../classcontrol_1_1PlanarArmController.html#a0d8b187d476a4140d5f1508c5ed7f50d',1,'control::PlanarArmController']]], - ['set_5fy_5fvel_286',['set_y_vel',['../classcontrol_1_1PlanarArmController.html#a55a1443d50e3e03bc99ceab615e3ca36',1,'control::PlanarArmController']]], - ['setactivation_287',['setActivation',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a43dab9b2aae0d48ae01cb70112009ee1',1,'cv::dnn::Layer']]], - ['setactivationfunction_288',['setActivationFunction',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a16998f97db903c1c652e68f342240524',1,'cv::ml::ANN_MLP']]], - ['setactivevarcount_289',['setActiveVarCount',['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html#a54beb36a90fbc804d5337a8b74933d09',1,'cv::ml::RTrees']]], - ['setadjustoutliers_290',['setAdjustOutliers',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a6eeadb4ea09e54a4252c8a81057a7431',1,'cv::ximgproc::AdaptiveManifoldFilter']]], - ['setagregationwindowsize_291',['setAgregationWindowSize',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a3056bdb39b0ae805f4c3922671af19d1',1,'cv::stereo::StereoBinaryBM']]], - ['setalgorithmtype_292',['setAlgorithmType',['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#aaa7548bc92dd0b43bb96e3c230e1997e',1,'cv::ml::KNearest']]], - ['setalpha_293',['setAlpha',['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html#a95a3951e82f853e3cfbd9edb8b8bc148',1,'cv::superres::BroxOpticalFlow::setAlpha()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a16d7f5ade6b0fce4d83cc27380755cc0',1,'cv::ximgproc::EdgeBoxes::setAlpha()'],['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a1ca264fc585dd4e6bb8f96235cb01fe4',1,'cv::ximgproc::RICInterpolator::setAlpha()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a89174e84691f8f7dfcf3511ee57de069',1,'cv::superres::SuperResolution::setAlpha()'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#a91929c3edede9f22fefc58c24ab863ba',1,'cv::VariationalRefinement::setAlpha()']]], - ['setangleepsilon_294',['setAngleEpsilon',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a6d0446ac2470a7c3c7656ace92a7b656',1,'cv::GeneralizedHoughGuil']]], - ['setanglestep_295',['setAngleStep',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a889384a9360ec2b7efdc0ff8fbbb4bf9',1,'cv::GeneralizedHoughGuil']]], - ['setanglethresh_296',['setAngleThresh',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a8411f94d623c66c6c53872a0f9c5416f',1,'cv::GeneralizedHoughGuil']]], - ['setanglethreshold_297',['setAngleThreshold',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#afdabf172865125c2c67a6de7f4c13e6d',1,'cv::rgbd::FastICPOdometry']]], - ['setangularbins_298',['setAngularBins',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#aade984ec5eca56b0a7f5b8681d681c61',1,'cv::ShapeContextDistanceExtractor']]], - ['setannealcoolingratio_299',['setAnnealCoolingRatio',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a5c1b54d05fc3ac1b167752ed452c0a5e',1,'cv::ml::ANN_MLP']]], - ['setannealenergyrng_300',['setAnnealEnergyRNG',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a6d7a3a6206a52f1d80268920361ae1b8',1,'cv::ml::ANN_MLP']]], - ['setannealfinalt_301',['setAnnealFinalT',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#aa6a0eeeb1725bed54b00882bf535715d',1,'cv::ml::ANN_MLP']]], - ['setannealinitialt_302',['setAnnealInitialT',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a4fda01324f3eb715f4c289adb386d875',1,'cv::ml::ANN_MLP']]], - ['setannealiteperstep_303',['setAnnealItePerStep',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a4ec199a72ea3cf8ea6b35a78afb86414',1,'cv::ml::ANN_MLP']]], - ['setapperturesize_304',['setAppertureSize',['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html#aac7d0602338e1a2a783811a929967714',1,'cv::cuda::CannyEdgeDetector']]], - ['setargs_305',['setArgs',['https://docs.opencv.org/4.2.0/dc/d02/classcv_1_1GCall.html#a59d99a6b69540532068360be493a90dc',1,'cv::GCall']]], - ['setautorelease_306',['setAutoRelease',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a45854282c3f6dc58a12b82cd53e50845',1,'cv::ogl::Arrays::setAutoRelease()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#aff9abd9111dfb14686a788eaaa94770a',1,'cv::ogl::Buffer::setAutoRelease()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#ace1fa264dc4a294bc26d2d074217cb4d',1,'cv::ogl::Texture2D::setAutoRelease()']]], - ['setbackground_307',['setBackground',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a176e1f18085d62b2b7b4a52e770e0b0b',1,'cv::ovis::WindowScene::setBackground(InputArray image)=0'],['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a941fccfb93b57de5923d6682fb2c8620',1,'cv::ovis::WindowScene::setBackground(const Scalar &color)=0']]], - ['setbackgroundcolor_308',['setBackgroundColor',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a8c0828b0ce2725aefaf3f89208e5f29f',1,'cv::viz::Viz3d']]], - ['setbackgroundmeshlab_309',['setBackgroundMeshLab',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a634ce6d63c1a9fb159d974aef58d953d',1,'cv::viz::Viz3d']]], - ['setbackgroundprior_310',['setBackgroundPrior',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a6298864b9feda4e5a85af7832b86038a',1,'cv::bgsegm::BackgroundSubtractorGMG::setBackgroundPrior()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#ab9eae4ff83156c056e75a2f01aebee62',1,'cv::cuda::BackgroundSubtractorGMG::setBackgroundPrior()']]], - ['setbackgroundratio_311',['setBackgroundRatio',['https://docs.opencv.org/4.2.0/d6/da7/classcv_1_1bgsegm_1_1BackgroundSubtractorMOG.html#afe4225db2b061ad86ea81245ef0197d6',1,'cv::bgsegm::BackgroundSubtractorMOG::setBackgroundRatio()'],['https://docs.opencv.org/4.2.0/d1/dfe/classcv_1_1cuda_1_1BackgroundSubtractorMOG.html#a16e03168604c382d4a3f4b5cff246ced',1,'cv::cuda::BackgroundSubtractorMOG::setBackgroundRatio()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#ab8bdfc9c318650aed53ecc836667b56a',1,'cv::BackgroundSubtractorMOG2::setBackgroundRatio()']]], - ['setbackgroundtexture_312',['setBackgroundTexture',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#afbc1293b9acd3fd932ca3f1ff649f065',1,'cv::viz::Viz3d']]], - ['setbackpropmomentumscale_313',['setBackpropMomentumScale',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a59fd3f49aba9418a96d44998deb68d00',1,'cv::ml::ANN_MLP']]], - ['setbackpropweightscale_314',['setBackpropWeightScale',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a80a03e3e259441438f7ae3312104161f',1,'cv::ml::ANN_MLP']]], - ['setbase_315',['setBase',['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#ac7baaf45599b3293408c0ebc394a5c35',1,'cv::saliency::ObjectnessBING']]], - ['setbase_316',['setbase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af57577148b39749ea52311d68d8a17b4',1,'std']]], - ['setbaseimage_317',['setBaseImage',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a4589ed0c65f2f02a049d603fac140f81',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], - ['setbbresdir_318',['setBBResDir',['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#aacd56c302c06a8182ee77598fc5128de',1,'cv::saliency::ObjectnessBING']]], - ['setbendingenergyweight_319',['setBendingEnergyWeight',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a576d05fc6eedd2353d5e03257d807808',1,'cv::ShapeContextDistanceExtractor']]], - ['setbeta_320',['setBeta',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#aa507a96446cf40c246ea6ad58adeb81e',1,'cv::ximgproc::EdgeBoxes']]], - ['setbias_321',['setBias',['https://docs.opencv.org/4.2.0/da/d53/classcv_1_1TonemapDrago.html#ae2efd6e5273ac86ed76a2ca89939aaba',1,'cv::TonemapDrago']]], - ['setbinarykerneltype_322',['setBinaryKernelType',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a5c56c7e2c65c4e1656cab06c3e8ddda5',1,'cv::stereo::StereoBinaryBM::setBinaryKernelType()'],['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#aba6accc59d827028635117452a8e5df0',1,'cv::stereo::StereoBinarySGBM::setBinaryKernelType()']]], - ['setblackthreshold_323',['setBlackThreshold',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1structured__light_1_1GrayCodePattern.html#a3607cba801a696881df31bbd6c59c4fd',1,'cv::structured_light::GrayCodePattern']]], - ['setblender_324',['setBlender',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a79651cf9e4b87cb6af26caa0535b9baa',1,'cv::Stitcher']]], - ['setblocksize_325',['setBlockSize',['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a2100042d80ccf54b18d6513afff5a731',1,'cv::detail::BlocksCompensator::setBlockSize(int width, int height)'],['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a974bb46e14126304ceb3cee8ae34207f',1,'cv::detail::BlocksCompensator::setBlockSize(Size size)'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#ac44ba3d060603efa0af8da079f5fedb3',1,'cv::GFTTDetector::setBlockSize()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a5c17f52f01b7a289dbcb8912f1b89889',1,'cv::rgbd::RgbdPlane::setBlockSize()'],['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#a38814e8a33d59f4eb5db33de04fe8c34',1,'cv::StereoMatcher::setBlockSize()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#a494867781b98f903b4ca23c5e96e2f15',1,'cv::stereo::StereoMatcher::setBlockSize()']]], - ['setblurfordescriptor_326',['setBlurForDescriptor',['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#a6f1ff360e8700d57446d017fd4a0539e',1,'cv::cuda::ORB']]], - ['setblurkernelsize_327',['setBlurKernelSize',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#af5ee27c5ceda96493d76657384e18fe0',1,'cv::superres::SuperResolution']]], - ['setblurrinessrates_328',['setBlurrinessRates',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a79a9a2c76a22405a727fbb2b9c22bf22',1,'cv::videostab::DeblurerBase']]], - ['setblursigma_329',['setBlurSigma',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a082bfe061356d8d4f82ee1aa0578e86c',1,'cv::superres::SuperResolution']]], - ['setboosttype_330',['setBoostType',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a3506f61268d7845b1114c0d75f51b724',1,'cv::ml::Boost']]], - ['setbordermode_331',['setBorderMode',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#aaacb52b91f791b467b0e3f69a7ad80f5',1,'cv::videostab::MotionInpainter::setBorderMode()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a5c2b79352223792a044080dfd365b30b',1,'cv::videostab::StabilizerBase::setBorderMode()']]], - ['setbreakonerror_332',['setBreakOnError',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae4904ef072dede53cf161d9a6869083f',1,'cv::setBreakOnError()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae4904ef072dede53cf161d9a6869083f',1,'setBreakOnError()(Global Namespace)']]], - ['setbuf_333',['setbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#afdc468aedafb80e43f14569d09485e6b',1,'__gnu_cxx::enc_filebuf::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#afdc468aedafb80e43f14569d09485e6b',1,'__gnu_cxx::stdio_filebuf::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#aad2e731291673229100bde1f24ce828f',1,'__gnu_cxx::stdio_sync_filebuf::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#afdc468aedafb80e43f14569d09485e6b',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#afdc468aedafb80e43f14569d09485e6b',1,'basic_filebuf< char_type, traits_type >::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#aad2e731291673229100bde1f24ce828f',1,'basic_streambuf< _Elem, _Tr >::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#aad2e731291673229100bde1f24ce828f',1,'basic_streambuf< char, _Traits >::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#aad2e731291673229100bde1f24ce828f',1,'basic_streambuf< char, char_traits< char > >::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#afdc468aedafb80e43f14569d09485e6b',1,'std::basic_filebuf::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#aad2e731291673229100bde1f24ce828f',1,'std::basic_streambuf::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a3ecbb2133b5c6b598b0344b7cbbe1757',1,'std::basic_stringbuf::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#aad2e731291673229100bde1f24ce828f',1,'std::wbuffer_convert::setbuf()']]], - ['setbufferpoolconfig_334',['setBufferPoolConfig',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga93da1d4c64558590950409266b1e2a92',1,'cv::cuda::setBufferPoolConfig()'],['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga93da1d4c64558590950409266b1e2a92',1,'setBufferPoolConfig()(Global Namespace)']]], - ['setbufferpoolusage_335',['setBufferPoolUsage',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga7dbf253e43493eb870c9759cc35bbffb',1,'cv::cuda::setBufferPoolUsage()'],['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga7dbf253e43493eb870c9759cc35bbffb',1,'setBufferPoolUsage()(Global Namespace)']]], - ['setbundleadjuster_336',['setBundleAdjuster',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#aa3060cbd7d492a53052754439e830d40',1,'cv::Stitcher']]], - ['setc_337',['setC',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#af9f543ef011db0ded375bb6f68984142',1,'cv::ml::SVM']]], - ['setcalculatevarimportance_338',['setCalculateVarImportance',['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html#a9f034bb1cb935f54a66b8b711daa5ee0',1,'cv::ml::RTrees']]], - ['setcallback_339',['setCallback',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a6fab6401190231590ce607cfd6a53ba9',1,'cv::text::ERFilter']]], - ['setcamera_340',['setCamera',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a3ccaad72a408090922c3bf1061586ec0',1,'cv::viz::Viz3d']]], - ['setcameraintrinsicoptions_341',['setCameraIntrinsicOptions',['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html#aed6306f62d1bfc9a82ba8d6a47e911f5',1,'cv::sfm::BaseSFM::setCameraIntrinsicOptions()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#a54603b3cafcf57ab89effbd4f479c389',1,'cv::sfm::SFMLibmvEuclideanReconstruction::setCameraIntrinsicOptions()']]], - ['setcameraintrinsics_342',['setCameraIntrinsics',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a1dec8cc3123d4d37e5ab436ab6d2e62a',1,'cv::ovis::WindowScene']]], - ['setcameralookat_343',['setCameraLookAt',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a20cda38dfceeedbf62a67a2eb649f125',1,'cv::ovis::WindowScene']]], - ['setcameramatrix_344',['setCameraMatrix',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#ac77a0fe8d5d7bcd3e8d76f7626d2031a',1,'cv::rgbd::FastICPOdometry::setCameraMatrix()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#aa9e4e89e20f76445afb86127acb2fa8d',1,'cv::rgbd::ICPOdometry::setCameraMatrix()'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a658b4fd102a96211fba428b16633b1c8',1,'cv::rgbd::Odometry::setCameraMatrix()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a79e641eac7076266bbf8b602b19e136c',1,'cv::rgbd::RgbdICPOdometry::setCameraMatrix()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#aace77bf9b7c997cf34480db6660c186d',1,'cv::rgbd::RgbdOdometry::setCameraMatrix()']]], - ['setcameraparams_345',['setCameraParams',['https://docs.opencv.org/4.2.0/dc/d2c/structcv_1_1detail_1_1ProjectorBase.html#a8b90f9babaf26ca042a1cd872ded4da2',1,'cv::detail::ProjectorBase']]], - ['setcamerapose_346',['setCameraPose',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a798824edcea2af5e68bbb9feb65aa8bc',1,'cv::ovis::WindowScene']]], - ['setcannyhighthresh_347',['setCannyHighThresh',['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a0652a8600e2cc030a7d87be2d79ce5b1',1,'cv::GeneralizedHough']]], - ['setcannylowthresh_348',['setCannyLowThresh',['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a8206707627bc2b5b09b37da06f6580a6',1,'cv::GeneralizedHough']]], - ['setcannythreshold_349',['setCannyThreshold',['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#a4dbc24683ff04e2dbc791fd80d6a1076',1,'cv::cuda::HoughCirclesDetector']]], - ['setcellsize_350',['setCellSize',['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a88c504fb2b84717b57f6bb897a05b480',1,'cv::videostab::TranslationBasedLocalOutlierRejector']]], - ['setclassweights_351',['setClassWeights',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a9cb80c3df6c2626b9836eaa0e0c58bf0',1,'cv::ml::SVM']]], - ['setclip_352',['setClip',['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#a97199300e121417122739c0548fb54e7',1,'cv::viz::Camera']]], - ['setcliplimit_353',['setClipLimit',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1CLAHE.html#abc15ca6784ab92c0d93e8b013fac191f',1,'cv::CLAHE']]], - ['setclusterminmag_354',['setClusterMinMag',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#ac3b6fcdce4f94eb8f63c3bd94977f340',1,'cv::ximgproc::EdgeBoxes']]], - ['setclusterminsize_355',['setClusterMinSize',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a9b1788e47f815b0bdba559062e1be914',1,'cv::xfeatures2d::PCTSignatures']]], - ['setclustersnumber_356',['setClustersNumber',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a069ee46c360ed183d5eb96b8b8261d8a',1,'cv::ml::EM']]], - ['setcmdvel_357',['setCmdVel',['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html#a52eb0845b28f3e387f244b1d0ff906df',1,'net::mc::tasks::PowerRepeatTask::setCmdVel()'],['../namespacerobot.html#a8363ee6c4c4bd4b93c4188984dc77ad6',1,'robot::setCmdVel()']]], - ['setcoef0_358',['setCoef0',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#af0cd3684aabfacbd6749d8649d5971ed',1,'cv::ml::SVM']]], - ['setcolor_359',['setColor',['https://docs.opencv.org/4.2.0/d3/d49/classcv_1_1viz_1_1Widget2D.html#a75b6f7d02e74feb8e032cb0451c8d712',1,'cv::viz::Widget2D::setColor()'],['https://docs.opencv.org/4.2.0/d9/d26/classcv_1_1viz_1_1Widget3D.html#ab467fdefb482d6a0da42528ab98738a1',1,'cv::viz::Widget3D::setColor()']]], - ['setcoloradaptation_360',['setColorAdaptation',['https://docs.opencv.org/4.2.0/d0/dec/classcv_1_1TonemapReinhard.html#ad9c85bea5573d6384a716c05d4e681fd',1,'cv::TonemapReinhard']]], - ['setcolorarray_361',['setColorArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#ad1ac4dcf3a6a09e0e1c30f6da1bc87ad',1,'cv::ogl::Arrays']]], - ['setcolorsaturation_362',['setColorSaturation',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#aa66dca22cadf9293164bef39f3690a94',1,'cv::bioinspired::Retina']]], - ['setcols_363',['setCols',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#abb66d5573dd304273b35a9e150a946e3',1,'cv::rgbd::RgbdNormals']]], - ['setcomplexityreductionthreshold_364',['setComplexityReductionThreshold',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#af45a64f718ef1b43ca8f738c496408f1',1,'cv::BackgroundSubtractorMOG2']]], - ['setcompositingresol_365',['setCompositingResol',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#afe927e80fcb2ca2061630ddd98eebba8',1,'cv::Stitcher']]], - ['setcompositors_366',['setCompositors',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#aaae12c1ffbdaeb8bbd1e8c75512379c3',1,'cv::ovis::WindowScene']]], - ['setconfidence_367',['setConfidence',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a59629ac1b318ace9e4fb34ec9379d22e',1,'cv::stereo::Matching']]], - ['setconfthresh_368',['setConfThresh',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#aa5e180dd73dc7ce4fa1627fda01b1bfc',1,'cv::detail::BundleAdjusterBase']]], - ['setconstant_369',['setConstant',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac2f1e50d1f567da38da1d2f07c5ab559',1,'Eigen::DenseBase::setConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac2f1e50d1f567da38da1d2f07c5ab559',1,'DenseBase< ArrayWrapper< ExpressionType > >::setConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac2f1e50d1f567da38da1d2f07c5ab559',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::setConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac2f1e50d1f567da38da1d2f07c5ab559',1,'DenseBase< Solve< Decomposition, RhsType > >::setConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'Eigen::PlainObjectBase::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'Eigen::PlainObjectBase::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'Eigen::PlainObjectBase::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'Eigen::PlainObjectBase::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a02574e5085e789ff9840d2b708e0126f',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::setConstant()']]], - ['setconstructfcn_370',['setConstructFcn',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#a23c09862e5cc752a9ee6feea85735a9a',1,'cv::detail::GArrayU']]], - ['setcontrast_371',['setContrast',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga99eaaa24dc25ba387093e957bfca1cad',1,'cv::xphoto::TonemapDurand::setContrast()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga99eaaa24dc25ba387093e957bfca1cad',1,'setContrast()(Global Namespace)']]], - ['setcontrastweight_372',['setContrastWeight',['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html#af75eb4cbbc759e8ce7ba9514703fba4b',1,'cv::MergeMertens']]], - ['setcorrectionforinclusion_373',['setCorrectionForInclusion',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ada19bffb5b015f14af92e7c472989605',1,'cv::videostab::StabilizerBase']]], - ['setcostextractor_374',['setCostExtractor',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a1d3a0258c206f4be2d3c518f1087f425',1,'cv::ShapeContextDistanceExtractor']]], - ['setcostfunction_375',['setCostFunction',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a03aed0908c6b514c37ed3f00c0b057dd',1,'cv::detail::DpSeamFinder::setCostFunction(CostFunction val)'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#aa4fd3c779d56b18d2ba806558957c04a',1,'cv::detail::DpSeamFinder::setCostFunction(String val)']]], - ['setcostmap_376',['setCostMap',['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#aa0367be883adbf08cb8036c8fbae35fa',1,'cv::ximgproc::EdgeAwareInterpolator::setCostMap()'],['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a2893aa23abdafec8c5efd45773a83ba4',1,'cv::ximgproc::RICInterpolator::setCostMap()']]], - ['setcovariancematrixtype_377',['setCovarianceMatrixType',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a8b383c62697eac9a972931674790f6cd',1,'cv::ml::EM']]], - ['setcrosssegmentationthreshold_378',['setCrossSegmentationThreshold',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a768354f41902b51e43956d8f46802c77',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['setctrsize_379',['setCtrSize',['https://docs.opencv.org/4.2.0/d5/d72/classcv_1_1ximgproc_1_1ContourFitting.html#a24bfff7e1fe21efb3e5af97e132fdfd6',1,'cv::ximgproc::ContourFitting']]], - ['setcurrentconfidencemap_380',['setCurrentConfidenceMap',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a8fb853d6fc31fdbb1f9b6ac97c3210c9',1,'cv::TrackerStateEstimatorAdaBoosting::setCurrentConfidenceMap()'],['https://docs.opencv.org/4.2.0/d9/d20/classcv_1_1TrackerStateEstimatorMILBoosting.html#a543b3e1409b9493297bfbabcf3f94dc8',1,'cv::TrackerStateEstimatorMILBoosting::setCurrentConfidenceMap()']]], - ['setcustomkernel_381',['setCustomKernel',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a16a3ddfd7bad030268f024f5a6c561f1',1,'cv::ml::SVM']]], - ['setcut_382',['setCut',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a7558c6509092d713c29ac92cffcc1355',1,'cv::AlignMTB']]], - ['setcvfolds_383',['setCVFolds',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a082ed33b1dd2101152dd33bdc2847404',1,'cv::ml::DTrees']]], - ['setdataweight_384',['setDataWeight',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#abbc588e1bbd3713e4520af5e349fd648',1,'cv::cuda::StereoBeliefPropagation']]], - ['setdeblurer_385',['setDeblurer',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a45319b46a3729c36cda4f664da2a69b1',1,'cv::videostab::StabilizerBase']]], - ['setdebugflag_386',['setDebugFlag',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga00c72e5ec4298bad4394ce601affe294',1,'cvv']]], - ['setdecisionthreshold_387',['setDecisionThreshold',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a76fcbe31b69127db9679f4dd7769de5a',1,'cv::bgsegm::BackgroundSubtractorGMG::setDecisionThreshold()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a66aa29ab364fd739986b238b218ed5af',1,'cv::cuda::BackgroundSubtractorGMG::setDecisionThreshold()']]], - ['setdefaultallocator_388',['setDefaultAllocator',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a5cc463cf6516957a2d78bd03c6d81de5',1,'cv::cuda::GpuMat::setDefaultAllocator()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a536a771cbad0b8360091e0315ebfc524',1,'cv::Mat::setDefaultAllocator()']]], - ['setdefaultcost_389',['setDefaultCost',['https://docs.opencv.org/4.2.0/df/d9a/classcv_1_1HistogramCostExtractor.html#aea35e7379f43e4c1b09ae5cfbce41547',1,'cv::HistogramCostExtractor']]], - ['setdefaultk_390',['setDefaultK',['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#a0e4bbe73142a27fda05f73125b1ed5ef',1,'cv::ml::KNearest']]], - ['setdefaultlearningrate_391',['setDefaultLearningRate',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#ae56c2448a3fdfe4ba00777a43730dbb9',1,'cv::bgsegm::BackgroundSubtractorGMG::setDefaultLearningRate()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#ac462bb405ba371e78c36af46b6e0e4c7',1,'cv::cuda::BackgroundSubtractorGMG::setDefaultLearningRate()']]], - ['setdegree_392',['setDegree',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a756297055239fa33536c09b0f5721494',1,'cv::ml::SVM']]], - ['setdelta_393',['setDelta',['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#a9828f6a0cc9b0aebf87db9ee34c8b2f7',1,'cv::MSER::setDelta()'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#a8622fbe02661bf7e38f28956f38a086b',1,'cv::VariationalRefinement::setDelta()']]], - ['setdepth_394',['setDepth',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a3a95549cdfc2d0b57573cdc64f064fab',1,'cv::rgbd::DepthCleaner::setDepth()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a5cc4d09c16df66b4de115b5ed557b46b',1,'cv::rgbd::RgbdNormals::setDepth()']]], - ['setdepthdiscontinuityradius_395',['setDepthDiscontinuityRadius',['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1ximgproc_1_1DisparityWLSFilter.html#af813957e9c5526df8dbf23e7012dd26d',1,'cv::ximgproc::DisparityWLSFilter']]], - ['setdescription_396',['setDescription',['../classcam_1_1Camera.html#a59dedb4d0b920e2a141e02b7d6b05a36',1,'cam::Camera']]], - ['setdescriptorchannels_397',['setDescriptorChannels',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#ac08316db91d007c7c0899efb0f222605',1,'cv::AKAZE']]], - ['setdescriptorextractor_398',['setDescriptorExtractor',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a6a3f98641555cf96c5f7abd8e5433346',1,'cv::ccalib::CustomPattern']]], - ['setdescriptorfast_399',['setDescriptorFast',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#af67c8ec077bd1593054f9d63280c6627',1,'cv::tbm::ITrackerByMatching']]], - ['setdescriptorformat_400',['setDescriptorFormat',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a6e3e1075a567268f2dfb2151b1c99cb6',1,'cv::cuda::HOG']]], - ['setdescriptormatcher_401',['setDescriptorMatcher',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a18a96fa9cde8fcbb52ad28c649d9cec6',1,'cv::ccalib::CustomPattern']]], - ['setdescriptorsize_402',['setDescriptorSize',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a3629d114449e442954fb26fb245422f1',1,'cv::AKAZE']]], - ['setdescriptorstrong_403',['setDescriptorStrong',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#aa0210aeffbb16ba50975999dbccc34db',1,'cv::tbm::ITrackerByMatching']]], - ['setdescriptortype_404',['setDescriptorType',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a845d6c10f25b3c0abe1b40aa6b4f83fb',1,'cv::AKAZE']]], - ['setdetector_405',['setDetector',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a629366ab4e0e482425c244f66a121337',1,'cv::videostab::KeypointBasedMotionEstimator']]], - ['setdetectshadows_406',['setDetectShadows',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#a7bc545ab1db20d1522b429cacbf4917d',1,'cv::BackgroundSubtractorKNN::setDetectShadows()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a329fea969ebfb55814f85418b63c4d96',1,'cv::BackgroundSubtractorMOG2::setDetectShadows()']]], - ['setdevice_407',['setDevice',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gaefa34186b185de47851836dba537828b',1,'cv::cuda::setDevice()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gaefa34186b185de47851836dba537828b',1,'setDevice()(Global Namespace)']]], - ['setdeviceid_408',['setDeviceId',['https://docs.opencv.org/4.2.0/d7/d8d/classcv_1_1cnn__3dobj_1_1descriptorExtractor.html#a2d2ae7ec2cc9aba124c710de765f0d07',1,'cv::cnn_3dobj::descriptorExtractor']]], - ['setdevicetype_409',['setDeviceType',['https://docs.opencv.org/4.2.0/d7/d8d/classcv_1_1cnn__3dobj_1_1descriptorExtractor.html#a373a97505c37993ab912130d2b620e96',1,'cv::cnn_3dobj::descriptorExtractor']]], - ['setdiffusivity_410',['setDiffusivity',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#ac216bff9fc19f9506373ed9251ca3b77',1,'cv::AKAZE::setDiffusivity()'],['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a636da9c984f4f5b1d7c7423b39d8a012',1,'cv::KAZE::setDiffusivity()']]], - ['setdiscsinglejump_411',['setDiscSingleJump',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#ae26d0eca3406ae9449054de5531a4abd',1,'cv::cuda::StereoBeliefPropagation']]], - ['setdisp12maxdiff_412',['setDisp12MaxDiff',['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#aede8620506ff7f27d106fff25777514d',1,'cv::StereoMatcher::setDisp12MaxDiff()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#a09a0171a2ebbc5678c17e26981e53f0d',1,'cv::stereo::StereoMatcher::setDisp12MaxDiff()']]], - ['setdist2threshold_413',['setDist2Threshold',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#aae40ce724aa313259609606853b6956f',1,'cv::BackgroundSubtractorKNN']]], - ['setdistancefast_414',['setDistanceFast',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a4643ca0a52399b93f28d19323d4d4583',1,'cv::tbm::ITrackerByMatching']]], - ['setdistanceflag_415',['setDistanceFlag',['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1HausdorffDistanceExtractor.html#a4469fbc8322ee88d34b4dc885e173ec6',1,'cv::HausdorffDistanceExtractor']]], - ['setdistancefunction_416',['setDistanceFunction',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a828b6802c9960647a128b966f7a79045',1,'cv::xfeatures2d::PCTSignatures']]], - ['setdistancestrong_417',['setDistanceStrong',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#aa2364e3e085dcd0c488cc6940193885c',1,'cv::tbm::ITrackerByMatching']]], - ['setdistthreshold_418',['setDistThreshold',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#acec803125f370bd1708fdf72b560f656',1,'cv::videostab::MotionInpainter']]], - ['setdosort_419',['setDoSort',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#af5b67e1d6259cba8c347b39e8641efa9',1,'cv::cuda::HoughLinesDetector']]], - ['setdp_420',['setDp',['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a82fa95feb453d5cb517e55ca20b199e4',1,'cv::GeneralizedHough::setDp()'],['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#af477bd20671090c1c74bbc32e87f1ebf',1,'cv::cuda::HoughCirclesDetector::setDp()']]], - ['setdropthreshold_421',['setDropThreshold',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a48a8b9dcd84024b8cbdcd6d9eae220b7',1,'cv::xfeatures2d::PCTSignatures']]], - ['setdroptol_422',['setDroptol',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteLUT.html#a9628c5a595e9e984c72d1f8e671a6925',1,'Eigen::IncompleteLUT']]], - ['setedgemergethr_423',['setEdgeMergeThr',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a8d8dbca2ea4b46d4dcf86d343133a887',1,'cv::ximgproc::EdgeBoxes']]], - ['setedgeminmag_424',['setEdgeMinMag',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a5d77b36ebe5918fdd2187055398bb07d',1,'cv::ximgproc::EdgeBoxes']]], - ['setedgepoints_425',['setEdgePoints',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#adc6ca8745fd0d7a28a38c31deb0b1342',1,'cv::Subdiv2D']]], - ['setedgethreshold_426',['setEdgeThreshold',['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#aa4d68e6dc2b69dfa023d1c37f3a26d83',1,'cv::cuda::DisparityBilateralFilter::setEdgeThreshold()'],['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a0a8924532c4c76c74899fe541678cfd1',1,'cv::ORB::setEdgeThreshold()']]], - ['setemax_427',['setEmax',['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#a6b5975897bfc53ebc35b88414512f6f0',1,'cv::ml::KNearest']]], - ['setempty_428',['setEmpty',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a16bc3e6779107a091f08e4cb7e36e793',1,'Eigen::AlignedBox']]], - ['setentitylookat_429',['setEntityLookAt',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a96d28d1cfb421d70b396a26087139f8b',1,'cv::ovis::WindowScene']]], - ['setentitypose_430',['setEntityPose',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#abc5d20d153b972827eea8ab831e06fd6',1,'cv::ovis::WindowScene']]], - ['setentityproperty_431',['setEntityProperty',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a784df6d58dffe66a2d3d84f94f3cc44f',1,'cv::ovis::WindowScene::setEntityProperty(const String &name, int prop, const Scalar &value)=0'],['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#ae88505afc2349dbe4156acb42c7e94ea',1,'cv::ovis::WindowScene::setEntityProperty(const String &name, int prop, const String &value)=0']]], - ['setepick_432',['setEPICK',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#ada4f31769858114fc948024c61b18a75',1,'cv::optflow::DenseRLOFOpticalFlow']]], - ['setepiclambda_433',['setEPICLambda',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a3212d9248b833b155dda737b17b389a8',1,'cv::optflow::DenseRLOFOpticalFlow']]], - ['setepicsigma_434',['setEPICSigma',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a7cde3a02095187974a61729a049f02ea',1,'cv::optflow::DenseRLOFOpticalFlow']]], - ['setepsilon_435',['setEpsilon',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a0bd444460924f21db113dd278cfe70e6',1,'cv::optflow::DualTVL1OpticalFlow::setEpsilon()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#abdcf95d17ff645f978be66aa1ddcc4b3',1,'cv::superres::DualTVL1OpticalFlow::setEpsilon()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#ae58efcc59c522c98f218a69b1fc2414d',1,'cv::cuda::OpticalFlowDual_TVL1::setEpsilon()']]], - ['setepsx_436',['setEpsX',['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a1a2d277d1fd2bc466aa2a7bb0458dd51',1,'cv::QRCodeDetector']]], - ['setepsy_437',['setEpsY',['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a31a93aaed30ce03fee7ddbe16d9fd800',1,'cv::QRCodeDetector']]], - ['setestimatetrimratio_438',['setEstimateTrimRatio',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a9c5f4df50af8214defda588f3c6be4d7',1,'cv::videostab::TwoPassStabilizer']]], - ['setestimator_439',['setEstimator',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a29fecbbacdfd0adc964f8ce451c0046b',1,'cv::Stitcher']]], - ['seteta_440',['setEta',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#aa52186543a9f4436baecb20b07a7d774',1,'cv::ximgproc::EdgeBoxes']]], - ['setexception_441',['setException',['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#a0d730091355100fb0300c9b6533034d6',1,'cv::AsyncPromise']]], - ['setexceptionmode_442',['setExceptionMode',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#afcab97adfa090883dce5523e9ebcb995',1,'cv::VideoCapture']]], - ['setexcluderange_443',['setExcludeRange',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#aeed184da3483a94c8a25351555d41b6a',1,'cv::AlignMTB']]], - ['setexp_444',['setExp',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga22d81509e98aefb71a1966cb2f5901d9',1,'cv::softdouble::setExp()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3701dfb1bc90fcb6de674e4d7f73cd98',1,'cv::softfloat::setExp()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3701dfb1bc90fcb6de674e4d7f73cd98',1,'setExp()(Global Namespace)']]], - ['setexposurecompensator_445',['setExposureCompensator',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a487373f15a54192e6a85ce6b04151d91',1,'cv::Stitcher']]], - ['setexposureweight_446',['setExposureWeight',['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html#a00d81f2a0a6c0f3abd2fd21ad57f58c9',1,'cv::MergeMertens']]], - ['setextended_447',['setExtended',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#ab32e09a09bc9d5475601e309bbb04f02',1,'cv::KAZE::setExtended()'],['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html#a2809dee4e7cc6979b5d1e7523f73c075',1,'cv::xfeatures2d::SURF::setExtended()']]], - ['setf_448',['setf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'basic_ios< char, _Traits >::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'basic_ios< char, _Traits >::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'basic_iostream< char >::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'basic_iostream< char >::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'basic_istream< char >::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'basic_istream< char >::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'basic_istream< char, _Traits >::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'basic_istream< char, _Traits >::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'basic_ostream< char >::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'basic_ostream< char >::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'basic_ostream< char, _Traits >::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'basic_ostream< char, _Traits >::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_fstream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_fstream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_ifstream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_ifstream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_ios::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_ios::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_iostream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_iostream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_istream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_istream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_istringstream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_istringstream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_ofstream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_ofstream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_ostream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_ostream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_ostringstream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_ostringstream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_stringstream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_stringstream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::ios_base::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::ios_base::setf(fmtflags __fmtfl, fmtflags __mask)']]], - ['setfacedetector_449',['setFaceDetector',['https://docs.opencv.org/4.2.0/dc/de0/classcv_1_1face_1_1FacemarkKazemi.html#a8bed56231214aad70b91a5573b2a8aa6',1,'cv::face::FacemarkKazemi::setFaceDetector()'],['https://docs.opencv.org/4.2.0/d3/d81/classcv_1_1face_1_1FacemarkTrain.html#a39ba4218820e388732655c2916034ea3',1,'cv::face::FacemarkTrain::setFaceDetector()']]], - ['setfastpyramids_450',['setFastPyramids',['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#ad1e4f8b3a53098f5994a2048bd84ef92',1,'cv::FarnebackOpticalFlow::setFastPyramids()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#a07ad12f9f47f8fcf5a90c9a39377d440',1,'cv::cuda::FarnebackOpticalFlow::setFastPyramids()']]], - ['setfastthreshold_451',['setFastThreshold',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#abc0be00ff58954f680c66e7703d842f0',1,'cv::ORB::setFastThreshold()'],['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#af692ce9bbe10838f92d40335151251bf',1,'cv::cuda::ORB::setFastThreshold()']]], - ['setfdsize_452',['setFDSize',['https://docs.opencv.org/4.2.0/d5/d72/classcv_1_1ximgproc_1_1ContourFitting.html#a15d09cb24987736bf9bbb9241170da0f',1,'cv::ximgproc::ContourFitting']]], - ['setfeaturedesc_453',['setFeatureDesc',['https://docs.opencv.org/4.2.0/de/db5/structHaarClassifierNode128.html#aa978dba6f257f99c200633a9e2be56c4',1,'HaarClassifierNode128']]], - ['setfeaturedetector_454',['setFeatureDetector',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a8bb63fb54c4d07790c4501b8e09db92e',1,'cv::ccalib::CustomPattern']]], - ['setfeatureextractor_455',['setFeatureExtractor',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#addc69a1f46fb1b037438802c90bf640a',1,'cv::TrackerKCF']]], - ['setfeatures_456',['setFeatures',['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html#a2dfb54d37bcd3c30cb9200b0852be2a2',1,'cv::TrackerStateEstimatorMILBoosting::TrackerMILTargetState']]], - ['setfeaturesfinder_457',['setFeaturesFinder',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a943d01c149aa987e289f6be9b63d4e4b',1,'cv::Stitcher']]], - ['setfeaturesmatcher_458',['setFeaturesMatcher',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ada7fb8b0e696bfe3104f73d07ab0b5c4',1,'cv::Stitcher']]], - ['setfgslambda_459',['setFGSLambda',['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#ab3330056c1e6b07e15172cd8faba0f10',1,'cv::ximgproc::EdgeAwareInterpolator::setFGSLambda()'],['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a64f56bd383d752f9a7f8754d57d05f88',1,'cv::ximgproc::RICInterpolator::setFGSLambda()']]], - ['setfgslambda_460',['setFgsLambda',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#ab067f2d36dda3a951dd2788d1d3db404',1,'cv::optflow::DenseRLOFOpticalFlow']]], - ['setfgssigma_461',['setFGSSigma',['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#adc63515cb3306cf4de5ae8e2986e3358',1,'cv::ximgproc::EdgeAwareInterpolator::setFGSSigma()'],['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a3418698f404f83b66114ccdf3cf69e1c',1,'cv::ximgproc::RICInterpolator::setFGSSigma()']]], - ['setfgssigma_462',['setFgsSigma',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a0160ff5b02b666b5ced648241137ab43',1,'cv::optflow::DenseRLOFOpticalFlow']]], - ['setfill_463',['setfill',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af02c6886dba8d934606592e0f3e11d5c',1,'std']]], - ['setfillfactor_464',['setFillfactor',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteLUT.html#a327767d12b55ff8a023f12a030051e17',1,'Eigen::IncompleteLUT']]], - ['setfindlargestobject_465',['setFindLargestObject',['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a39e517368b8b95f40b5b9c07778f38c4',1,'cv::cuda::CascadeClassifier']]], - ['setfinestscale_466',['setFinestScale',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a802aad5131797bc8d97b8715d83c9dc1',1,'cv::DISOpticalFlow']]], - ['setfirstlevel_467',['setFirstLevel',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a2771f3db7f2a2d5340ba26775f59d331',1,'cv::ORB']]], - ['setfixedpointiterations_468',['setFixedPointIterations',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#af3ce307e3f8628c5d621f420c883a75a',1,'cv::VariationalRefinement']]], - ['setflags_469',['setFlags',['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#a1297d4b32eeae6c61f90ca1ab47b66ea',1,'cv::FarnebackOpticalFlow::setFlags()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#a45e787a5305d6ce6e7cb119aa2d31a6d',1,'cv::cuda::FarnebackOpticalFlow::setFlags()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#adbbe97ca07eb1175ffc6bd9dc4092327',1,'cv::superres::FarnebackOpticalFlow::setFlags()'],['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html#aae8dae87e3609e80b9f8a2ef3d68b51c',1,'cv::SparsePyrLKOpticalFlow::setFlags()'],['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a4a7e562d10be02f026af8492778c50b5',1,'cv::instr::setFlags(FLAGS modeFlags)'],['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab969571185d4fec9f235ff5b2febf280',1,'cv::instr::setFlags(int modeFlags)']]], - ['setflowerrorthreshold_470',['setFlowErrorThreshold',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#a3421c028fcdc3646969be927d5b6a0e7',1,'cv::videostab::MotionInpainter']]], - ['setflowsmoothness_471',['setFlowSmoothness',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#a14f843e96bc75a2580cbc4da489affdf',1,'cv::cuda::BroxOpticalFlow']]], - ['setforwardbackward_472',['setForwardBackward',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a17a0a5f547951b23c2e2de91516c4d86',1,'cv::optflow::DenseRLOFOpticalFlow::setForwardBackward()'],['https://docs.opencv.org/4.2.0/df/dc4/classcv_1_1optflow_1_1SparseRLOFOpticalFlow.html#a077ba6fe986801476d83fcfbe9d4b908',1,'cv::optflow::SparseRLOFOpticalFlow::setForwardBackward()']]], - ['setfov_473',['setFov',['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#a57adc00dd7c597cdb41e8f4b05650334',1,'cv::viz::Camera']]], - ['setfrac_474',['setFrac',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4a950579c5ad9d00e235f4d4dba79308',1,'cv::softdouble::setFrac()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga356bf2e1eb0897c509af1a02dc23f1f5',1,'cv::softfloat::setFrac()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga356bf2e1eb0897c509af1a02dc23f1f5',1,'setFrac(const softfloat &s) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4a950579c5ad9d00e235f4d4dba79308',1,'setFrac(const softdouble &s) const(Global Namespace)']]], - ['setframecount_475',['setFrameCount',['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#aa58c2478a945594504e1efd17bcf2a9a',1,'cv::videostab::WobbleSuppressorBase']]], - ['setframemask_476',['setFrameMask',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html#ac82d2de9d188ca96e6e7e0455cfa079a',1,'cv::videostab::ImageMotionEstimatorBase::setFrameMask()'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#aa1ad1af1c82b1231a81db24512e81221',1,'cv::videostab::KeypointBasedMotionEstimator::setFrameMask()'],['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html#ac6c1414027021c240767cfceaef7f10f',1,'cv::videostab::ToFileMotionWriter::setFrameMask()']]], - ['setframes_477',['setFrames',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a2449d268c8bd111c6250175c5bcca77d',1,'cv::videostab::DeblurerBase::setFrames()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a9c9c42ea041ec6e67db0041df4e022c8',1,'cv::videostab::InpainterBase::setFrames()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a4ef1cc113b04949c32bce6629dad6f70',1,'cv::videostab::InpaintingPipeline::setFrames()']]], - ['setframesize_478',['setFrameSize',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a79c7c7ff5d2fa5ad71acef8e719765e9',1,'cv::videostab::LpMotionStabilizer']]], - ['setframesource_479',['setFrameSource',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a107e9f7960b7efd7e210b5e178118021',1,'cv::videostab::StabilizerBase']]], - ['setfromtriplets_480',['setFromTriplets',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#acc35051d698e3973f1de5b9b78dbe345',1,'Eigen::SparseMatrix::setFromTriplets(const InputIterators &begin, const InputIterators &end)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3eee2d3d2a9843cd095c0207f781e7e',1,'Eigen::SparseMatrix::setFromTriplets(const InputIterators &begin, const InputIterators &end, DupFunctor dup_func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#acc35051d698e3973f1de5b9b78dbe345',1,'SparseMatrix< Scalar >::setFromTriplets(const InputIterators &begin, const InputIterators &end)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3eee2d3d2a9843cd095c0207f781e7e',1,'SparseMatrix< Scalar >::setFromTriplets(const InputIterators &begin, const InputIterators &end, DupFunctor dup_func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#acc35051d698e3973f1de5b9b78dbe345',1,'SparseMatrix< Scalar, ColMajor, int >::setFromTriplets(const InputIterators &begin, const InputIterators &end)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3eee2d3d2a9843cd095c0207f781e7e',1,'SparseMatrix< Scalar, ColMajor, int >::setFromTriplets(const InputIterators &begin, const InputIterators &end, DupFunctor dup_func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#acc35051d698e3973f1de5b9b78dbe345',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::setFromTriplets(const InputIterators &begin, const InputIterators &end)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3eee2d3d2a9843cd095c0207f781e7e',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::setFromTriplets(const InputIterators &begin, const InputIterators &end, DupFunctor dup_func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#acc35051d698e3973f1de5b9b78dbe345',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::setFromTriplets(const InputIterators &begin, const InputIterators &end)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3eee2d3d2a9843cd095c0207f781e7e',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::setFromTriplets(const InputIterators &begin, const InputIterators &end, DupFunctor dup_func)']]], - ['setfromtwovectors_481',['setFromTwoVectors',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7ae84bfbcc9f3f19f10294496a836bee',1,'Eigen::QuaternionBase::setFromTwoVectors()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7ae84bfbcc9f3f19f10294496a836bee',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::setFromTwoVectors()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7ae84bfbcc9f3f19f10294496a836bee',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::setFromTwoVectors()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7ae84bfbcc9f3f19f10294496a836bee',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::setFromTwoVectors()']]], - ['setfullaffine_482',['setFullAffine',['https://docs.opencv.org/4.2.0/dc/d83/classcv_1_1AffineTransformer.html#af564eade3ef6b5c6cc7983228a4d5d99',1,'cv::AffineTransformer']]], - ['setfullscreen_483',['setFullScreen',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a29ea9ecc93aa5b02d616e5896ca40214',1,'cv::viz::Viz3d']]], - ['setfunction_484',['setFunction',['https://docs.opencv.org/4.2.0/df/d11/classcv_1_1MinProblemSolver.html#a22632a6392d2e159a8e01c2ed697cbe0',1,'cv::MinProblemSolver']]], - ['setg_485',['setg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'__gnu_cxx::enc_filebuf::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'__gnu_cxx::stdio_filebuf::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'__gnu_cxx::stdio_sync_filebuf::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'basic_filebuf< char_type, traits_type >::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'basic_streambuf< _Elem, _Tr >::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'basic_streambuf< char, _Traits >::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'basic_streambuf< char, char_traits< char > >::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'std::basic_filebuf::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'std::basic_streambuf::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'std::basic_stringbuf::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'std::wbuffer_convert::setg()']]], - ['setgains_486',['setGains',['../classcontrol_1_1PIDController.html#aea65837319357d27620c3ba2df9c5fa3',1,'control::PIDController']]], - ['setgamma_487',['setGamma',['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html#a2fecc011bc9656d088ccecf9e4f33e77',1,'cv::superres::BroxOpticalFlow::setGamma()'],['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#ad99682d2f2edf2c6be8feef5586cc5d6',1,'cv::optflow::DualTVL1OpticalFlow::setGamma()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a47d65e7c28908a80dd744363337b654b',1,'cv::ximgproc::EdgeBoxes::setGamma()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#ac52c588112632661ee6d17d14254f2ca',1,'cv::cuda::OpticalFlowDual_TVL1::setGamma()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a1e15d72e1bbba64a9650ea65910135e7',1,'cv::ml::SVM::setGamma()'],['https://docs.opencv.org/4.2.0/d8/d5e/classcv_1_1Tonemap.html#ac809d2967f942b038b4bf21c97f8b1b7',1,'cv::Tonemap::setGamma()'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#af549f9e93768f4e1ebc5cdec585586ec',1,'cv::VariationalRefinement::setGamma()']]], - ['setgammacorrection_488',['setGammaCorrection',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a0eb2f1ecf59ccc599bffac3a0a55562f',1,'cv::cuda::HOG']]], - ['setgldevice_489',['setGlDevice',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga7da4b94fc78501f4239c132901387730',1,'cv::cuda::setGlDevice()'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga7da4b94fc78501f4239c132901387730',1,'setGlDevice()(Global Namespace)']]], - ['setglobalmotionransacthreshold_490',['setGlobalMotionRansacThreshold',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#ac530a1661e5db651e3bdfa60cce8a1ac',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['setglobalwarnings_491',['setGlobalWarnings',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a25aa4d0064aadaf591de9fd5a710502f',1,'cv::viz::Viz3d']]], - ['setgradientconstancyimportance_492',['setGradientConstancyImportance',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#af4f9c30ced899e3f9c13414295227aeb',1,'cv::cuda::BroxOpticalFlow']]], - ['setgradientdescentiterations_493',['setGradientDescentIterations',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a184662b1f15fc3f7581bc61568a362fd',1,'cv::DISOpticalFlow']]], - ['setgrayscalebits_494',['setGrayscaleBits',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a1d9a4dd5b5b91d8e9f8195c7e496b9c3',1,'cv::xfeatures2d::PCTSignatures']]], - ['setgridlinesnumber_495',['setGridLinesNumber',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#ab2b90907daef5a058b4ceedf4dc0bca5',1,'cv::plot::Plot2d']]], - ['setgridstep_496',['setGridStep',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a11293fe3836fa27ab6cab491da2a4296',1,'cv::optflow::DenseRLOFOpticalFlow']]], - ['setgridx_497',['setGridX',['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html#ad65975baee31dbf3bd2a750feef74831',1,'cv::face::LBPHFaceRecognizer']]], - ['setgridy_498',['setGridY',['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html#a9cebb0138dbb3553b27beb2df3924ae6',1,'cv::face::LBPHFaceRecognizer']]], - ['setgroupthreshold_499',['setGroupThreshold',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#adad9af4e4ed0e0a045a70cd44520eefd',1,'cv::cuda::HOG']]], - ['sethalidescheduler_500',['setHalideScheduler',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a56fbff351d1e0a47fb5aabf6915fc279',1,'cv::dnn::Net']]], - ['setharrisdetector_501',['setHarrisDetector',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#ae91924c613b0736f338ae541d7c51a4e',1,'cv::GFTTDetector']]], - ['setheartbeattimedouthandler_502',['setHeartbeatTimedOutHandler',['../classnet_1_1websocket_1_1WebSocketProtocol.html#ae7ab0bf75c4a72f14330f5c8c3c3ff43',1,'net::websocket::WebSocketProtocol']]], - ['sethessianthreshold_503',['setHessianThreshold',['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html#a8b788ad30c4d395f5f7f3cdb98126c09',1,'cv::xfeatures2d::SURF']]], - ['sethighthreshold_504',['setHighThreshold',['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html#a63d352fe7f3bad640e63f4e394619235',1,'cv::cuda::CannyEdgeDetector']]], - ['sethistbinnum_505',['setHistBinNum',['https://docs.opencv.org/4.2.0/d4/d3b/classcv_1_1xphoto_1_1LearningBasedWB.html#a3381bd425bc4201133c9669071908e7f',1,'cv::xphoto::LearningBasedWB']]], - ['sethistory_506',['setHistory',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#adc3ce00b7ff6061ec0d255405aa1625f',1,'cv::BackgroundSubtractorKNN::setHistory()'],['https://docs.opencv.org/4.2.0/d6/da7/classcv_1_1bgsegm_1_1BackgroundSubtractorMOG.html#a1f4ce27ad2f4859b69f3b8232dc265c2',1,'cv::bgsegm::BackgroundSubtractorMOG::setHistory()'],['https://docs.opencv.org/4.2.0/d1/dfe/classcv_1_1cuda_1_1BackgroundSubtractorMOG.html#a552f9cfa624f79859ace02fa21dcf6cc',1,'cv::cuda::BackgroundSubtractorMOG::setHistory()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a5e8b40fef89a582ce42d99d2453db67a',1,'cv::BackgroundSubtractorMOG2::setHistory()']]], - ['sethitthreshold_507',['setHitThreshold',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a8b623393c11d18b89fa373269b97aea4',1,'cv::cuda::HOG']]], - ['sethostdirty_508',['setHostDirty',['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#a4c5604039feba47dd6d93e50a1ec130c',1,'cv::dnn::BackendWrapper']]], - ['setidentity_509',['setIdentity',['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a58fabb4849fa44233c21f088ac33aa06',1,'Eigen::DiagonalMatrix::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a0b2d7eb480c889693fb31fbdb02d9c09',1,'Eigen::DiagonalMatrix::setIdentity(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a18e969adfdf2db4ac44c47fbdc854683',1,'Eigen::MatrixBase::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a97dec020729928e328fe8ae9aad1e99e',1,'Eigen::MatrixBase::setIdentity(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a18e969adfdf2db4ac44c47fbdc854683',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a97dec020729928e328fe8ae9aad1e99e',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::setIdentity(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a18e969adfdf2db4ac44c47fbdc854683',1,'MatrixBase< Solve< Decomposition, RhsType > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a97dec020729928e328fe8ae9aad1e99e',1,'MatrixBase< Solve< Decomposition, RhsType > >::setIdentity(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a6805bb75fd7966ea71895c24ff196444',1,'Eigen::PermutationBase::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a830a80511a61634ef437795916f7f8da',1,'Eigen::PermutationBase::setIdentity(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a6805bb75fd7966ea71895c24ff196444',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a830a80511a61634ef437795916f7f8da',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::setIdentity(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a6805bb75fd7966ea71895c24ff196444',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a830a80511a61634ef437795916f7f8da',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::setIdentity(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a6805bb75fd7966ea71895c24ff196444',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a830a80511a61634ef437795916f7f8da',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::setIdentity(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a6805bb75fd7966ea71895c24ff196444',1,'PermutationBase< PermutationWrapper< _IndicesType > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a830a80511a61634ef437795916f7f8da',1,'PermutationBase< PermutationWrapper< _IndicesType > >::setIdentity(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a4695b0f6eebfb217ae2fbd579ceda24a',1,'Eigen::QuaternionBase::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a4695b0f6eebfb217ae2fbd579ceda24a',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a4695b0f6eebfb217ae2fbd579ceda24a',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a4695b0f6eebfb217ae2fbd579ceda24a',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a89013d2aa58413672c90932607a0d6f0',1,'Eigen::SparseMatrix::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a89013d2aa58413672c90932607a0d6f0',1,'SparseMatrix< Scalar >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a89013d2aa58413672c90932607a0d6f0',1,'SparseMatrix< Scalar, ColMajor, int >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a89013d2aa58413672c90932607a0d6f0',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a89013d2aa58413672c90932607a0d6f0',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#accf8eb8ac609d20cf099c62124c0505a',1,'Eigen::Transform::setIdentity()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga388d7575224a4a277ceb98ccaa327c99',1,'cv::setIdentity()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga388d7575224a4a277ceb98ccaa327c99',1,'setIdentity()(Global Namespace)']]], - ['setimage_510',['setImage',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a15cca93757ada6866173cdb91da9dae1',1,'cv::CvFeatureEvaluator::setImage()'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a20cf619f2ead04d968406d68b285084e',1,'cv::CvHaarEvaluator::setImage()'],['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#afe4152b207830ea1e86d5ad653664a05',1,'cv::CvHOGEvaluator::setImage()'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#a97a4d6f1937d0204e7a76d5970274bf8',1,'cv::CvLBPEvaluator::setImage()'],['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategy.html#a0f0668bc6e5759374a4b324e328dc13e',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentationStrategy::setImage()'],['https://docs.opencv.org/4.2.0/d7/d3d/classcv_1_1viz_1_1WImage3D.html#ab102aeb6a8c7cd993b22634ff03585d9',1,'cv::viz::WImage3D::setImage()'],['https://docs.opencv.org/4.2.0/d8/d33/classcv_1_1viz_1_1WImageOverlay.html#a6d18fe29e23944bdca21751acb906c13',1,'cv::viz::WImageOverlay::setImage()']]], - ['setimageappearanceweight_511',['setImageAppearanceWeight',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a92798b785faa75fb7e41c2cee8ac19db',1,'cv::ShapeContextDistanceExtractor']]], - ['setimageheight_512',['setImageHeight',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#aece9eba7fc039fb64a7f9b20e4763625',1,'cv::saliency::MotionSaliencyBinWangApr2014::setImageHeight()'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#ab42ba04a0cf4941d3ce46be51b802924',1,'cv::saliency::StaticSaliencySpectralResidual::setImageHeight()']]], - ['setimages_513',['setImages',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#abf94ec647328dcdf648157933f6f32b1',1,'cv::ShapeContextDistanceExtractor']]], - ['setimagesize_514',['setImagesize',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a9c7cf4b521ce10417bab29a33412881f',1,'cv::saliency::MotionSaliencyBinWangApr2014']]], - ['setimagewidth_515',['setImageWidth',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a81bacd9f5e1c41487da3f3c3d863d04d',1,'cv::saliency::MotionSaliencyBinWangApr2014::setImageWidth()'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#ae0bb047d91f20474d5fffb7260ac0750',1,'cv::saliency::StaticSaliencySpectralResidual::setImageWidth()']]], - ['setindicator_516',['setIndicator',['../namespacerobot.html#af3ae6c262d2a799a63437ed2ba481abb',1,'robot']]], - ['setinferenceenginebackendtype_517',['setInferenceEngineBackendType',['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a9caa7da18447ff7850ca962706482ec7',1,'cv::dnn']]], - ['setinitialmask_518',['setInitialMask',['https://docs.opencv.org/4.2.0/d2/da2/classcv_1_1TrackerCSRT.html#a0f35096b888cbd280a2b0c9bc0f94a3c',1,'cv::TrackerCSRT']]], - ['setinitialshift_519',['setInitialShift',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a409c9586e7d29566dda2c8f5e38a1228',1,'Eigen::IncompleteCholesky']]], - ['setinitialstepsize_520',['setInitialStepSize',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#abdba737e4293665f091f6433631f4dc9',1,'cv::ml::SVMSGD']]], - ['setinitseedindexes_521',['setInitSeedIndexes',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a0aa3ed847a3bd993e34a9bdb294212f5',1,'cv::xfeatures2d::PCTSignatures']]], - ['setinitstep_522',['setInitStep',['https://docs.opencv.org/4.2.0/d4/d43/classcv_1_1DownhillSolver.html#ab8038b328aee43b07760a346cebdc5a6',1,'cv::DownhillSolver']]], - ['setinneriterations_523',['setInnerIterations',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#ae765e5fad39a6660e7c7801e34c5f097',1,'cv::cuda::BroxOpticalFlow::setInnerIterations()'],['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html#aff45839677bd5deee3929db5923a1524',1,'cv::superres::BroxOpticalFlow::setInnerIterations()'],['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a369a6704fbf5448bdccc8269381d079f',1,'cv::optflow::DualTVL1OpticalFlow::setInnerIterations()']]], - ['setinnerradius_524',['setInnerRadius',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a1b9f6425a00d927f87ba77fb14b240bd',1,'cv::ShapeContextDistanceExtractor']]], - ['setinpainter_525',['setInpainter',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#add20a4cf58f541dbafcaa290a3c35f16',1,'cv::videostab::StabilizerBase']]], - ['setinput_526',['setInput',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a5e74adacffd6aa53d56046581de7fcbd',1,'cv::dnn::Net::setInput()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ac925acc676cb1141c801fa99eed66373',1,'cv::superres::SuperResolution::setInput()']]], - ['setinputcrop_527',['setInputCrop',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#af441526f30e98e84ebcd568aac7edc99',1,'cv::dnn::Model']]], - ['setinputmax_528',['setInputMax',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a6b2523a8740b353ef50e136d0399bf3a',1,'cv::xphoto::SimpleWB']]], - ['setinputmean_529',['setInputMean',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#abe381973a9b364eeade4b1cc30561cc8',1,'cv::dnn::Model']]], - ['setinputmin_530',['setInputMin',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a1b08a24a8589aae886fbf96ba27691a0',1,'cv::xphoto::SimpleWB']]], - ['setinputparams_531',['setInputParams',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a3af51e4292f8cbce196df311254826c2',1,'cv::dnn::Model']]], - ['setinputscale_532',['setInputScale',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a33c970dd73ba040819b08914bd83cc20',1,'cv::dnn::Model']]], - ['setinputsize_533',['setInputSize',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a8079e4b591dc8b04827d812600cf33e6',1,'cv::dnn::Model::setInputSize(const Size &size)'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#ac4dbf2e0c9a06ca5a973c42c7988b79e',1,'cv::dnn::Model::setInputSize(int width, int height)']]], - ['setinputsnames_534',['setInputsNames',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a4331f0fa17fd90db99cb68752c796fed',1,'cv::dnn::Net']]], - ['setinputswaprb_535',['setInputSwapRB',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a796ef4ba475bf705dad3cc8a5dac058d',1,'cv::dnn::Model']]], - ['setintensity_536',['setIntensity',['https://docs.opencv.org/4.2.0/d0/dec/classcv_1_1TonemapReinhard.html#af5d99afbaeb6ab1729e749504876fe34',1,'cv::TonemapReinhard']]], - ['setinterpolation_537',['setInterpolation',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a06cb0e2b59a8a3505c30b78bd3e7b2c3',1,'cv::optflow::DenseRLOFOpticalFlow']]], - ['setinterpolationflags_538',['setInterpolationFlags',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a253d04b8dcd3c674321b29139c769873',1,'cv::Stitcher']]], - ['setinvertorientation_539',['setInvertOrientation',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a81b27f15f7975042dc1d259c64435401',1,'cv::plot::Plot2d']]], - ['setiosflags_540',['setiosflags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab27c01e21b835749650e5f2ed2d16dbc',1,'std']]], - ['setisclassifier_541',['setIsClassifier',['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#adf7439615632c768fa0bd448615e09e8',1,'cv::ml::KNearest']]], - ['setisparallel_542',['setIsParallel',['https://docs.opencv.org/4.2.0/de/dca/classcv_1_1bgsegm_1_1BackgroundSubtractorCNT.html#a06427b5eecbfe5309cb00beb85f98cdb',1,'cv::bgsegm::BackgroundSubtractorCNT']]], - ['setiterationcount_543',['setIterationCount',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#aa2f1491f6cc4f99feed74a55c84a6950',1,'cv::xfeatures2d::PCTSignatures']]], - ['setiterationcounts_544',['setIterationCounts',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a4b330f0a4fe9af02ed5900b847bfea97',1,'cv::rgbd::FastICPOdometry::setIterationCounts()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a6287107408f045c34f9148f01b64638a',1,'cv::rgbd::ICPOdometry::setIterationCounts()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a14f7bb9d50983879e1a15843af08ad28',1,'cv::rgbd::RgbdICPOdometry::setIterationCounts()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a791fea684d3e44fa16b6e52705a51867',1,'cv::rgbd::RgbdOdometry::setIterationCounts()']]], - ['setiterations_545',['setIterations',['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#a2dc4023cdb6ab026d1a0d7094b4ad550',1,'cv::superres::DualTVL1OpticalFlow::setIterations()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#a71dbb1f03c461f5bea5cb06d371cbe7f',1,'cv::superres::FarnebackOpticalFlow::setIterations()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a77ecde450d828a236b77681f6cd375d8',1,'cv::ml::LogisticRegression::setIterations()'],['https://docs.opencv.org/4.2.0/de/d2b/classcv_1_1superres_1_1PyrLKOpticalFlow.html#a35f61e6b28f4f757e33da5be45ef89b3',1,'cv::superres::PyrLKOpticalFlow::setIterations()'],['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#ac90e93665a0d5d27a69dfef3f47b4255',1,'cv::ShapeContextDistanceExtractor::setIterations()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a6ca6d26088cadd9c178afd0fdfc2efb9',1,'cv::superres::SuperResolution::setIterations()']]], - ['setjoiningdistance_546',['setJoiningDistance',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a3b34e63ce62c9759d7a9747ba6549a78',1,'cv::xfeatures2d::PCTSignatures']]], - ['setjointpos_547',['setJointPos',['../namespacerobot.html#a22bae8dc460f5d2413092e99d59c6c07',1,'robot']]], - ['setjointpower_548',['setJointPower',['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html#a03c0709ff0e80f3921da8b7f4dd71f59',1,'net::mc::tasks::PowerRepeatTask']]], - ['setk_549',['setK',['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#a4b3f18fdfaae3b89fa4384dc7dec9229',1,'cv::ximgproc::EdgeAwareInterpolator::setK()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#a54427c38033b6c2de48c6a49b085ec29',1,'cv::GFTTDetector::setK()'],['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1ximgproc_1_1segmentation_1_1GraphSegmentation.html#afb0158f535ad5636161c3e4d6a6c7fb1',1,'cv::ximgproc::segmentation::GraphSegmentation::setK()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a667dc339ea0262412c399fa348daa605',1,'cv::rgbd::RgbdNormals::setK()'],['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a396da659ac5ee155802c46e1e96e6720',1,'cv::ximgproc::RICInterpolator::setK()']]], - ['setkappa_550',['setKappa',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a6dd86f3ac7ffd5d40034af9c6cc9b397',1,'cv::ximgproc::EdgeBoxes']]], - ['setkernel_551',['setKernel',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ad6f4f45983d06817b9782978ca0f6f6f',1,'cv::ml::SVM']]], - ['setkernelparam_552',['setKernelParam',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1img__hash_1_1MarrHildrethHash.html#a94ac77193c92d93af6bf0f9f7eaf2df2',1,'cv::img_hash::MarrHildrethHash']]], - ['setkernelsize_553',['setKernelSize',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a0f46fb0684a6bfe66ea36f3ca391c6cf',1,'cv::rgbd::FastICPOdometry::setKernelSize()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ab11a31f01e6df91838866e4ff35e6289',1,'cv::superres::SuperResolution::setKernelSize()']]], - ['setknnsamples_554',['setkNNSamples',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#acac38a02b7b32add859fbe78ef01b4ec',1,'cv::BackgroundSubtractorKNN']]], - ['setl2gradient_555',['setL2Gradient',['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html#ac2e8a675cc30cb3e621ac684e22f89d1',1,'cv::cuda::CannyEdgeDetector']]], - ['setl2hysthreshold_556',['setL2HysThreshold',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a30e5c88864fff774f403313993947d62',1,'cv::cuda::HOG']]], - ['setlabelinfo_557',['setLabelInfo',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#aabcb47adcddd719974681b2b7309d656',1,'cv::face::FaceRecognizer']]], - ['setlambda_558',['setLambda',['https://docs.opencv.org/4.2.0/da/d27/classcv_1_1CalibrateDebevec.html#ab2b47092bbe6234b8a046cd7104cdf77',1,'cv::CalibrateDebevec::setLambda()'],['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1ximgproc_1_1DisparityWLSFilter.html#af31f80b7fd9a7617377f2d8ff00ddee4',1,'cv::ximgproc::DisparityWLSFilter::setLambda()'],['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#accaa548e430fb147636dc8490f814d76',1,'cv::optflow::DualTVL1OpticalFlow::setLambda()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#a7d29592d5d4bbc8259d47182446ab372',1,'cv::superres::DualTVL1OpticalFlow::setLambda()'],['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#a57552468f71996f29062bd2a9eab6606',1,'cv::ximgproc::EdgeAwareInterpolator::setLambda()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#a41f3031da66ac69d44ef491ad9bc4417',1,'cv::cuda::OpticalFlowDual_TVL1::setLambda()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ad168b5c627c8bb291bc7d759c888dc98',1,'cv::superres::SuperResolution::setLambda()']]], - ['setlargewinsize_559',['setLargeWinSize',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a327582bea4742163dcf699ce5e9102c2',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['setlasttargetstate_560',['setLastTargetState',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a8be4baadf82e4d35b6aaf25eb19aa685',1,'cv::TrackerModel']]], - ['setlayersizes_561',['setLayerSizes',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a79731c3fd3168e28eb3c3bba7a2caa94',1,'cv::ml::ANN_MLP']]], - ['setlearningrate_562',['setLearningRate',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a1d050c28ca1fba9439961f76ba526cec',1,'cv::ml::LogisticRegression']]], - ['setleftnodedesc_563',['setLeftNodeDesc',['https://docs.opencv.org/4.2.0/de/db5/structHaarClassifierNode128.html#ae947fbf30026b45adc0802d799eaafe7',1,'HaarClassifierNode128']]], - ['setlength_564',['setLength',['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#a30cc06d5b2ca4b7dcf5fcd53313d25fc',1,'Eigen::HouseholderSequence']]], - ['setlevels_565',['setLevels',['https://docs.opencv.org/4.2.0/dc/d46/classcv_1_1GeneralizedHoughBallard.html#a234280317b918a2e439703a70abf55b1',1,'cv::GeneralizedHoughBallard::setLevels()'],['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#aef797ae7c1f6db4648cd85174f8d8f93',1,'cv::GeneralizedHoughGuil::setLevels()']]], - ['setlevelsnumber_566',['setLevelsNumber',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#a7fe7f02976e2e2b280058dabf8836aab',1,'cv::superres::FarnebackOpticalFlow']]], - ['setlightadaptation_567',['setLightAdaptation',['https://docs.opencv.org/4.2.0/d0/dec/classcv_1_1TonemapReinhard.html#a31feb20a5527923a55d463e25fcbc030',1,'cv::TonemapReinhard']]], - ['setlimitswitchlimits_568',['setLimitSwitchLimits',['../namespacecan_1_1motor.html#aaeed0f12c1b4d0867d8731cf19dbf40e',1,'can::motor']]], - ['setlinspaced_569',['setLinSpaced',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb023532476d3f14c457367e0eb5f3f1',1,'Eigen::DenseBase::setLinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5d1ce9e801fa502e02b9b8cd9141ad0a',1,'Eigen::DenseBase::setLinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb023532476d3f14c457367e0eb5f3f1',1,'DenseBase< ArrayWrapper< ExpressionType > >::setLinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5d1ce9e801fa502e02b9b8cd9141ad0a',1,'DenseBase< ArrayWrapper< ExpressionType > >::setLinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb023532476d3f14c457367e0eb5f3f1',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::setLinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5d1ce9e801fa502e02b9b8cd9141ad0a',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::setLinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb023532476d3f14c457367e0eb5f3f1',1,'DenseBase< Solve< Decomposition, RhsType > >::setLinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5d1ce9e801fa502e02b9b8cd9141ad0a',1,'DenseBase< Solve< Decomposition, RhsType > >::setLinSpaced(Index size, const Scalar &low, const Scalar &high)']]], - ['setlog_570',['setLog',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ad5a4f03a204822a1f17dd0fe5da6317d',1,'cv::videostab::StabilizerBase']]], - ['setloglevel_571',['setLogLevel',['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html#gaa022dd6c6e2d72539cc1e5100bcb378b',1,'cv::utils::logging::setLogLevel()'],['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html#gaa022dd6c6e2d72539cc1e5100bcb378b',1,'setLogLevel()(Global Namespace)']]], - ['setlogtaglevel_572',['setLogTagLevel',['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html#ga0bc84211764950ce24c66a8274255e72',1,'cv::utils::logging::setLogTagLevel()'],['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html#ga0bc84211764950ce24c66a8274255e72',1,'setLogTagLevel()(Global Namespace)']]], - ['setlowthreshold_573',['setLowThreshold',['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html#a6bdc1479c1557288a69c6314c61d1548',1,'cv::cuda::CannyEdgeDetector']]], - ['setlrcthresh_574',['setLRCthresh',['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1ximgproc_1_1DisparityWLSFilter.html#a3456a95d3b37ed72f140df872aada113',1,'cv::ximgproc::DisparityWLSFilter']]], - ['setmarginregularization_575',['setMarginRegularization',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a2e16734e58800183162d1ab6d7d8fe7f',1,'cv::ml::SVMSGD']]], - ['setmargintype_576',['setMarginType',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a79385571c8163f5c0c157e7a7e607a0b',1,'cv::ml::SVMSGD']]], - ['setmarkers_577',['setMarkers',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#a1b8a00a40198b20bd935d499257267c6',1,'cv::structured_light::SinusoidalPattern::Params']]], - ['setmaskcallback_578',['setMaskCallback',['https://docs.opencv.org/4.2.0/da/d26/classcv_1_1videostab_1_1MaskFrameSource.html#ac12698a6512574b5af3bec2f87b615cc',1,'cv::videostab::MaskFrameSource']]], - ['setmaskgenerator_579',['setMaskGenerator',['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#aa99dc34bdd04563d7adc1343dac6f300',1,'cv::BaseCascadeClassifier::setMaskGenerator()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a7628a59eefb561ecd79ad9d02bd69073',1,'cv::CascadeClassifier::setMaskGenerator()']]], - ['setmasksource_580',['setMaskSource',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a2cbb83ddf5c875ee83d88b75d00535c7',1,'cv::videostab::StabilizerBase']]], - ['setmatchingmask_581',['setMatchingMask',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad1591614305b0385f8a6152458f93955',1,'cv::Stitcher']]], - ['setmaterialproperty_582',['setMaterialProperty',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gaf7aaaa30b9398b06721d5d5971b9590b',1,'cv::ovis::setMaterialProperty(const String &name, int prop, const Scalar &value)'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga329b3d975bf26644caf7928044800344',1,'cv::ovis::setMaterialProperty(const String &name, int prop, const String &value)'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga3dfac94809b957393480bac0c11ca214',1,'cv::ovis::setMaterialProperty(const String &name, const String &prop, const Scalar &value)'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gaf7aaaa30b9398b06721d5d5971b9590b',1,'setMaterialProperty(const String &name, int prop, const Scalar &value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga329b3d975bf26644caf7928044800344',1,'setMaterialProperty(const String &name, int prop, const String &value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga3dfac94809b957393480bac0c11ca214',1,'setMaterialProperty(const String &name, const String &prop, const Scalar &value)(Global Namespace)']]], - ['setmatgains_583',['setMatGains',['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a1b86c5b1bec92ce5a30092c6799f0fc5',1,'cv::detail::BlocksCompensator::setMatGains()'],['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html#a7eaadbd98afa74803b63bc149942dc7f',1,'cv::detail::BlocksGainCompensator::setMatGains()'],['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html#a85d57777086b146524334bc4224f9f80',1,'cv::detail::ChannelsCompensator::setMatGains()'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad961c342a0a216eeddafc198766b6c1c',1,'cv::detail::ExposureCompensator::setMatGains()'],['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#acbdf968e6b9b3631f612403ac874bedc',1,'cv::detail::GainCompensator::setMatGains()'],['https://docs.opencv.org/4.2.0/d2/dc1/classcv_1_1detail_1_1NoExposureCompensator.html#a09bc74443d890ce13c95d81818f122b9',1,'cv::detail::NoExposureCompensator::setMatGains()']]], - ['setmaxangle_584',['setMaxAngle',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a0f4173d9464cdbfa072d746747812431',1,'cv::GeneralizedHoughGuil']]], - ['setmaxarea_585',['setMaxArea',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#aac25336b802dd8abbb92ee6b4daf0e50',1,'cv::text::ERFilter::setMaxArea()'],['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#ad768e2445e6cdacd6ed28b5fb533a464',1,'cv::MSER::setMaxArea()']]], - ['setmaxaspectratio_586',['setMaxAspectRatio',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a756ff7bee5a3b29a2f628ad310b596b6',1,'cv::ximgproc::EdgeBoxes']]], - ['setmaxbits_587',['setMaxBits',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a6f55841ed6e1f9482483595008250560',1,'cv::AlignMTB']]], - ['setmaxboxes_588',['setMaxBoxes',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#ace0a64b9189f7fe56ae1baf0f6dafaf5',1,'cv::ximgproc::EdgeBoxes']]], - ['setmaxbuffersize_589',['setMaxBufferSize',['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#add9b562933707cbf7728b30961e2ff93',1,'cv::GeneralizedHough']]], - ['setmaxcategories_590',['setMaxCategories',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a6d1571c10e5d72f8df7f102b916d704f',1,'cv::ml::DTrees']]], - ['setmaxcircles_591',['setMaxCircles',['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#a9f72ef28244ce031f493d8bd0e45e1e2',1,'cv::cuda::HoughCirclesDetector']]], - ['setmaxclusterscount_592',['setMaxClustersCount',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a4450e6f3e2676caaf4c78c9da7e6af6f',1,'cv::xfeatures2d::PCTSignatures']]], - ['setmaxdataterm_593',['setMaxDataTerm',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#a170d8ce45fad99435290e7d6ca0c8968',1,'cv::cuda::StereoBeliefPropagation']]], - ['setmaxdepth_594',['setMaxDepth',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#ab2192b5631da2d30eaaebdb12015f477',1,'cv::ml::DTrees::setMaxDepth()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a9f6c17376dc49f8bef4a1cee771871b2',1,'cv::rgbd::ICPOdometry::setMaxDepth()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a91904d6d9836de919c0c607400405555',1,'cv::rgbd::RgbdICPOdometry::setMaxDepth()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#af4f7239c1d52191c9ec997881b5de6d6',1,'cv::rgbd::RgbdOdometry::setMaxDepth()']]], - ['setmaxdepthdiff_595',['setMaxDepthDiff',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#ad7bba84dc1f971c6773be51a1836a25c',1,'cv::rgbd::ICPOdometry::setMaxDepthDiff()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#aeb101180d45e9aa737b4a03de93277d6',1,'cv::rgbd::RgbdICPOdometry::setMaxDepthDiff()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a793e4fdd3dc15215247c5fcbd5f52494',1,'cv::rgbd::RgbdOdometry::setMaxDepthDiff()']]], - ['setmaxdiscterm_596',['setMaxDiscTerm',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#acbd5b1a9fc089e9ebed870d28a25579b',1,'cv::cuda::StereoBeliefPropagation']]], - ['setmaxdiscthreshold_597',['setMaxDiscThreshold',['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#a57ddf3159765877a10ef8e74cf751e36',1,'cv::cuda::DisparityBilateralFilter']]], - ['setmaxdisparity_598',['setMaxDisparity',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a9285d28d89a43015de95872775bc9a4b',1,'cv::stereo::Matching']]], - ['setmaxdistdiff_599',['setMaxDistDiff',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#aa9ff85e53affef56b1042942c47de94d',1,'cv::rgbd::FastICPOdometry']]], - ['setmaxfeatures_600',['setMaxFeatures',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a2995c5c498745fe9ef6c36dea27a9a97',1,'cv::bgsegm::BackgroundSubtractorGMG::setMaxFeatures()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a6052b93f375b02d1279fae04fb51e6f3',1,'cv::cuda::BackgroundSubtractorGMG::setMaxFeatures()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#ade841e3ce9dc7e0c23e90442a6ff13df',1,'cv::GFTTDetector::setMaxFeatures()'],['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#aca471cb82c03b14d3e824e4dcccf90b7',1,'cv::ORB::setMaxFeatures()']]], - ['setmaxflow_601',['setMaxFlow',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a901bcd2172fdb268418824feea796dd9',1,'cv::ximgproc::RICInterpolator']]], - ['setmaxiter_602',['setMaxIter',['https://docs.opencv.org/4.2.0/d3/d30/classcv_1_1CalibrateRobertson.html#af4065c5709a957ae36f4da78200ace01',1,'cv::CalibrateRobertson']]], - ['setmaxiteration_603',['setMaxIteration',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a581f6499ab4ed1d8ac30117723d2e7df',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['setmaxiterations_604',['setMaxIterations',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a0c5a974da17774d75be41e351e6bda62',1,'Eigen::ComplexEigenSolver::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a6ca227fbd5387f3a625351354b8eec44',1,'Eigen::ComplexSchur::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a6ca227fbd5387f3a625351354b8eec44',1,'ComplexSchur< MatrixType >::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a6cff220aadfd8d8c1366b915ddefd164',1,'Eigen::EigenSolver::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#a2a6f96bd042068cfc0eafba839b424bd',1,'Eigen::GeneralizedEigenSolver::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#af83de7a7d31d9d4bd1fef6222b07335b',1,'Eigen::IterativeSolverBase::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a30ae65666b1757e4a2b6a28eaec12226',1,'Eigen::RealQZ::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a30ae65666b1757e4a2b6a28eaec12226',1,'RealQZ< MatrixType >::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#ad189e8776ee20a12046694f98b354322',1,'Eigen::RealSchur::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#ad189e8776ee20a12046694f98b354322',1,'RealSchur< MatrixType >::setMaxIterations()']]], - ['setmaxiters_605',['setMaxIters',['https://docs.opencv.org/4.2.0/d3/d6d/classcv_1_1LMSolver.html#ab6985da1052df9a4b88e5dd0b7d34bec',1,'cv::LMSolver']]], - ['setmaxlevel_606',['setMaxLevel',['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1cuda_1_1DensePyrLKOpticalFlow.html#a591e61e5930a84d05cb789a34766b984',1,'cv::cuda::DensePyrLKOpticalFlow::setMaxLevel()'],['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html#a5d44ea309f365bd5be14ff855f246661',1,'cv::videostab::PyrLkOptFlowEstimatorBase::setMaxLevel()'],['https://docs.opencv.org/4.2.0/de/d2b/classcv_1_1superres_1_1PyrLKOpticalFlow.html#a4f2edc8e45f95994c04065eae4b99faf',1,'cv::superres::PyrLKOpticalFlow::setMaxLevel()'],['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a51fc4589ed64202038fafdd9324a90a2',1,'cv::optflow::RLOFOpticalFlowParameter::setMaxLevel()'],['https://docs.opencv.org/4.2.0/d7/d05/classcv_1_1cuda_1_1SparsePyrLKOpticalFlow.html#af592f24ff8a10313cb97d0dbd3b5f825',1,'cv::cuda::SparsePyrLKOpticalFlow::setMaxLevel()'],['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html#a7698f83b203e18781da3b46eeb0363d1',1,'cv::SparsePyrLKOpticalFlow::setMaxLevel()']]], - ['setmaxlinegap_607',['setMaxLineGap',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html#a23319b68e050918b52857a2815b57823',1,'cv::cuda::HoughSegmentDetector']]], - ['setmaxlines_608',['setMaxLines',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#afe1e1e89113e20a3eafcc0c76639798a',1,'cv::cuda::HoughLinesDetector::setMaxLines()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html#aa196bbf7cb2840ebd52b162adcd14509',1,'cv::cuda::HoughSegmentDetector::setMaxLines()']]], - ['setmaxnumobjects_609',['setMaxNumObjects',['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a7b86aedaf7ba94827b36bc3dbca6b323',1,'cv::cuda::CascadeClassifier']]], - ['setmaxnumpoints_610',['setMaxNumPoints',['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#adda718a41fddd6825ae8787d8e594567',1,'cv::cuda::FastFeatureDetector']]], - ['setmaxobjectsize_611',['setMaxObjectSize',['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#ab48f89668d33f9a0db3979351b66da20',1,'cv::cuda::CascadeClassifier::setMaxObjectSize()'],['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#ae2d73cf36e6f3882625576eb300a3712',1,'cv::DetectionBasedTracker::IDetector::setMaxObjectSize()']]], - ['setmaxpixelstability_612',['setMaxPixelStability',['https://docs.opencv.org/4.2.0/de/dca/classcv_1_1bgsegm_1_1BackgroundSubtractorCNT.html#a45447da072fb9ffeec62f3932e3b153c',1,'cv::bgsegm::BackgroundSubtractorCNT']]], - ['setmaxpixelvalue_613',['setMaxPixelValue',['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#ab11b13da4d0e5074e3cf9ab1dc9053b1',1,'cv::quality::QualityPSNR']]], - ['setmaxpointspart_614',['setMaxPointsPart',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a162a63aa33a447a11595296fd463ef7a',1,'cv::rgbd::ICPOdometry::setMaxPointsPart()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a7f046b11dcce8ea265c78d4c0209c505',1,'cv::rgbd::RgbdICPOdometry::setMaxPointsPart()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#afbeca1b304b4dbaa3e3bc89bbbddff81',1,'cv::rgbd::RgbdOdometry::setMaxPointsPart()']]], - ['setmaxradius_615',['setMaxRadius',['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#a287affcc09e29f3f4fe822b4c612fab1',1,'cv::cuda::HoughCirclesDetector']]], - ['setmaxreservedsize_616',['setMaxReservedSize',['https://docs.opencv.org/4.2.0/d4/dad/classcv_1_1BufferPoolController.html#a006b69935da9979e4e501117565e741b',1,'cv::BufferPoolController']]], - ['setmaxrotation_617',['setMaxRotation',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a0afd7b4b944978a1eb0efd8b3bd0c2fb',1,'cv::rgbd::ICPOdometry::setMaxRotation()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a530843e43b5b96461a883b384fc6d34a',1,'cv::rgbd::RgbdICPOdometry::setMaxRotation()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a4434c203116af42439814d5f7f4d028d',1,'cv::rgbd::RgbdOdometry::setMaxRotation()']]], - ['setmaxscale_618',['setMaxScale',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a65c1d3b008a9f5bb61d3d95adf4570cc',1,'cv::GeneralizedHoughGuil']]], - ['setmaxtranslation_619',['setMaxTranslation',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#ad4e04a2482e4e030dcf0670e1f25a8a1',1,'cv::rgbd::ICPOdometry::setMaxTranslation()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#aa6b99fadf368002a1c52c30ff1bce332',1,'cv::rgbd::RgbdICPOdometry::setMaxTranslation()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#ab4ec5d5cbe15102247ef4f96d6a13e28',1,'cv::rgbd::RgbdOdometry::setMaxTranslation()']]], - ['setmaxval_620',['setMaxVal',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a43268a30fb0145482972691a308e3745',1,'cv::bgsegm::BackgroundSubtractorGMG::setMaxVal()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a8aab0648eb6a57904ee63a319b618f39',1,'cv::cuda::BackgroundSubtractorGMG::setMaxVal()']]], - ['setmaxx_621',['setMaxX',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#ab3e573f72f8b2b9be1120ada692b9481',1,'cv::plot::Plot2d']]], - ['setmaxy_622',['setMaxY',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#afd8e2b5d0132e1442c2a7830b27b1e84',1,'cv::plot::Plot2d']]], - ['setmedianfiltering_623',['setMedianFiltering',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a1ca8b74445dc347b229c9bbb05f85a8f',1,'cv::optflow::DualTVL1OpticalFlow']]], - ['setmethod_624',['setMethod',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a642d2d765a87429235113b31538d2690',1,'cv::rgbd::DepthCleaner::setMethod()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a8322dd53b4b5e763fdae73f3795f1290',1,'cv::rgbd::RgbdNormals::setMethod()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#aa5402321410147ef5c9ae4771f22684d',1,'cv::rgbd::RgbdPlane::setMethod()']]], - ['setminangle_625',['setMinAngle',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a303a0eebee227d4b27ddf4a0ae211658',1,'cv::GeneralizedHoughGuil']]], - ['setminarea_626',['setMinArea',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a457ad45027b98ea259dddf8469958d68',1,'cv::text::ERFilter::setMinArea()'],['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#a90de7b99fcbcf2b184420dedcb5912b3',1,'cv::MSER::setMinArea()']]], - ['setminboxarea_627',['setMinBoxArea',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a6e6139e8b52e931c6b0aedb0c79cb3cd',1,'cv::ximgproc::EdgeBoxes']]], - ['setmindepth_628',['setMinDepth',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a6f0b190dc9d7e7f6c7c0ddc036a98085',1,'cv::rgbd::ICPOdometry::setMinDepth()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a3f3bdad40f449d5dcabcf3229bf86cbf',1,'cv::rgbd::RgbdICPOdometry::setMinDepth()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#aecb015d50e96cc83d8d021ac288ecd3f',1,'cv::rgbd::RgbdOdometry::setMinDepth()']]], - ['setmindisparity_629',['setMinDisparity',['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#ae67a506bfe7fbd37444b6713aea1c0ad',1,'cv::StereoMatcher::setMinDisparity()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#aae2525ed014e9a5a61485a1bc58622b3',1,'cv::stereo::StereoMatcher::setMinDisparity()']]], - ['setmindist_630',['setMinDist',['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a4a0b12ead2b701c2574d3354cd02d349',1,'cv::GeneralizedHough::setMinDist()'],['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#a58fff962c301faf3c7640b78070545e1',1,'cv::cuda::HoughCirclesDetector::setMinDist()']]], - ['setmindistance_631',['setMinDistance',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#a02d13a8b58df03f5165a9ca5262aae86',1,'cv::GFTTDetector']]], - ['setmineigenvalue_632',['setMinEigenValue',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a75c0aa8331325065b9ab95fe795be05b',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['setmineigthreshold_633',['setMinEigThreshold',['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html#aab2a4c2a318a1448d43b1a544c8be934',1,'cv::SparsePyrLKOpticalFlow']]], - ['setmingradientmagnitudes_634',['setMinGradientMagnitudes',['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a49d95e87df435be465ffa979733d97b9',1,'cv::rgbd::RgbdICPOdometry::setMinGradientMagnitudes()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#aea7b12bc88c1b6bb305bc1909d05b972',1,'cv::rgbd::RgbdOdometry::setMinGradientMagnitudes()']]], - ['setminibatchsize_635',['setMiniBatchSize',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a1ba3ea00151b9671534e65fe936402b2',1,'cv::ml::LogisticRegression']]], - ['setmininlierratio_636',['setMinInlierRatio',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#ab1d351054cc4adbbf9875156874fedd8',1,'cv::videostab::MotionEstimatorRansacL2']]], - ['setminlinelength_637',['setMinLineLength',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html#a447c927941b2eba54a76b73ac816f638',1,'cv::cuda::HoughSegmentDetector']]], - ['setminneighbors_638',['setMinNeighbors',['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#ab46735fa5ab7d20672665fbfaa6a442b',1,'cv::cuda::CascadeClassifier']]], - ['setminneighbours_639',['setMinNeighbours',['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#adfc30759564fd402d3d9a4dc30bcb798',1,'cv::DetectionBasedTracker::IDetector']]], - ['setminobjectsize_640',['setMinObjectSize',['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#aedf17c846fbf3e80fd80f213d3daa600',1,'cv::cuda::CascadeClassifier::setMinObjectSize()'],['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#a04fefc396886a457f4569660d4c66c0e',1,'cv::DetectionBasedTracker::IDetector::setMinObjectSize()']]], - ['setminpixelstability_641',['setMinPixelStability',['https://docs.opencv.org/4.2.0/de/dca/classcv_1_1bgsegm_1_1BackgroundSubtractorCNT.html#a17f664133da264400f4a87dc361a9f4d',1,'cv::bgsegm::BackgroundSubtractorCNT']]], - ['setminprobability_642',['setMinProbability',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a1d3a364456467554ae4ddae96d289de6',1,'cv::text::ERFilter']]], - ['setminprobabilitydiff_643',['setMinProbabilityDiff',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a3700dd942539b9bd86de0feaef3456d7',1,'cv::text::ERFilter']]], - ['setminradius_644',['setMinRadius',['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#a0cccc5738c37a5fb48757224ef144e10',1,'cv::cuda::HoughCirclesDetector']]], - ['setminregionsizei_645',['setMinRegionSizeI',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#aec3051481425596ce245adfe057605ef',1,'cv::hfs::HfsSegment']]], - ['setminregionsizeii_646',['setMinRegionSizeII',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#ae5b55d3546448628b94beab5a8c76126',1,'cv::hfs::HfsSegment']]], - ['setminsamplecount_647',['setMinSampleCount',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#abe34fc6e9a172b9e334abcca94e28fb6',1,'cv::ml::DTrees']]], - ['setminscale_648',['setMinScale',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#ac661ec2f0a3583f6a0577b3496c44ae0',1,'cv::GeneralizedHoughGuil']]], - ['setminscore_649',['setMinScore',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a71ed3438a7ebeb98e7154a6546b57927',1,'cv::ximgproc::EdgeBoxes']]], - ['setminsize_650',['setMinSize',['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1ximgproc_1_1segmentation_1_1GraphSegmentation.html#a27940f63af4381a5c2215c49f3f9d276',1,'cv::ximgproc::segmentation::GraphSegmentation::setMinSize()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a9f9cc2c6e54ce89965c9ce202c181208',1,'cv::rgbd::RgbdPlane::setMinSize()']]], - ['setminval_651',['setMinVal',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a10a0bafa8580ff3083be7a4fe05f55bf',1,'cv::bgsegm::BackgroundSubtractorGMG::setMinVal()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#aee733b0a696af37d123e1c0c47b2ab97',1,'cv::cuda::BackgroundSubtractorGMG::setMinVal()']]], - ['setminx_652',['setMinX',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a85abe289195196730e5cdb73c16e7821',1,'cv::plot::Plot2d']]], - ['setminy_653',['setMinY',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a76d23672f328558b3d9d4e14ad3bec1e',1,'cv::plot::Plot2d']]], - ['setmode_654',['setMode',['https://docs.opencv.org/4.2.0/df/d55/classcv_1_1img__hash_1_1BlockMeanHash.html#aac726ac99777a8250b9560120acee961',1,'cv::img_hash::BlockMeanHash::setMode()'],['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a04e347de4f882dd8824ef6d673584560',1,'cv::stereo::StereoBinarySGBM::setMode()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#a32617c11dbdac9b689711a38cd928017',1,'cv::StereoSGBM::setMode()'],['https://docs.opencv.org/4.2.0/da/d3e/classcv_1_1TrackerSamplerCS.html#a6a89c1a694cd60dd98e7ae2cec492068',1,'cv::TrackerSamplerCS::setMode()'],['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#afbee269d2fbcdf6d76fae512d157b606',1,'cv::TrackerSamplerCSC::setMode()']]], - ['setmodel_655',['setModel',['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1dnn__superres_1_1DnnSuperResImpl.html#a1310dbcef0e4d59d7342d9b9d0ddcef7',1,'cv::dnn_superres::DnnSuperResImpl']]], - ['setmodeliter_656',['setModelIter',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#afd78f4175df04c60b7c4485642fb2a4f',1,'cv::ximgproc::RICInterpolator']]], - ['setmotionestimator_657',['setMotionEstimator',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a6e8c33ea40e8dde5b5083c16338307c6',1,'cv::videostab::StabilizerBase::setMotionEstimator()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a1d219dd75f827edc8128c84a66f6242e',1,'cv::videostab::WobbleSuppressorBase::setMotionEstimator()']]], - ['setmotionfilter_658',['setMotionFilter',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#af63308021cfb37cf696836665d78a820',1,'cv::videostab::OnePassStabilizer']]], - ['setmotionmodel_659',['setMotionModel',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html#afa8d7b05663b5ab2f70dd24a344fac44',1,'cv::videostab::ImageMotionEstimatorBase::setMotionModel()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#ae6b922a0eac6e676f0b1574fe388645b',1,'cv::videostab::InpainterBase::setMotionModel()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a8c4c28f4607190586ab6798d8a79329a',1,'cv::videostab::InpaintingPipeline::setMotionModel()'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a39e32aad5e5befe66b1f63a4c90ca0f4',1,'cv::videostab::KeypointBasedMotionEstimator::setMotionModel()'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a518fd7f0509c5c65abf1fa3bda53b59b',1,'cv::videostab::LpMotionStabilizer::setMotionModel()'],['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html#a7ef89b8847fc28a75bf4199b8f194340',1,'cv::videostab::MotionEstimatorBase::setMotionModel()'],['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html#af1b5617fa890b67fae05e834eff08a39',1,'cv::videostab::ToFileMotionWriter::setMotionModel()']]], - ['setmotions_660',['setMotions',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#ada073eb8634a26003e1b63a784bda641',1,'cv::videostab::DeblurerBase::setMotions()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a91ea73b4944c3f852ae48dff5cc48557',1,'cv::videostab::InpainterBase::setMotions()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a20a3c9acf34d3251bfbaa9f831473c63',1,'cv::videostab::InpaintingPipeline::setMotions()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a5052a8611fcfeba174f81da6ad7b86a8',1,'cv::videostab::WobbleSuppressorBase::setMotions(const std::vector< Mat > &val)']]], - ['setmotions2_661',['setMotions2',['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#adf3da51295d954d3a5371126aced4d14',1,'cv::videostab::WobbleSuppressorBase']]], - ['setmotionstabilizer_662',['setMotionStabilizer',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#af234eec62a25308270c95f7f066e74aa',1,'cv::videostab::TwoPassStabilizer']]], - ['setmotormode_663',['setMotorMode',['../namespacecan_1_1motor.html#aa5c314d6964158f588099ae2cce5a161',1,'can::motor']]], - ['setmotorpidconstants_664',['setMotorPIDConstants',['../namespacecan_1_1motor.html#af4cac5edf238d3d3dce9cd2b32015751',1,'can::motor']]], - ['setmotorpidtarget_665',['setMotorPIDTarget',['../namespacecan_1_1motor.html#a77e1a69516ed47142f01d7e2394dc44c',1,'can::motor']]], - ['setmotorpos_666',['setMotorPos',['../classrobot_1_1base__motor.html#aec029f50295879b3750f954449af93fe',1,'robot::base_motor::setMotorPos()'],['../classrobot_1_1can__motor.html#abc7a7fef8b60196a0fe3cd4b46e4f4b1',1,'robot::can_motor::setMotorPos()'],['../classrobot_1_1sim__motor.html#a07ff50c316cc1c2bf96e4ea3d93fb0ef',1,'robot::sim_motor::setMotorPos()'],['../namespacerobot.html#a885f8a319493d7b6c2143a2414409d7a',1,'robot::setMotorPos()']]], - ['setmotorpower_667',['setMotorPower',['../classrobot_1_1base__motor.html#a50ed7e9cd52824ea7f565f3d19cf2c6d',1,'robot::base_motor::setMotorPower()'],['../classrobot_1_1can__motor.html#a8c6f8c9360ee2f37bf1a0a02d3df037f',1,'robot::can_motor::setMotorPower()'],['../classrobot_1_1sim__motor.html#a83cfa2565029955dea5fbc6c1e4d0a72',1,'robot::sim_motor::setMotorPower()'],['../namespacecan_1_1motor.html#a4b1bd661cbd859a8b6a169b2b0386e28',1,'can::motor::setMotorPower(deviceserial_t serial, double power)'],['../namespacecan_1_1motor.html#a3c251243129745f601b9c1a770ea7939',1,'can::motor::setMotorPower(deviceserial_t serial, int16_t power)'],['../namespacerobot.html#ad44ac5c5e111853330b0025450e2acc3',1,'robot::setMotorPower()']]], - ['setmotorvel_668',['setMotorVel',['../classrobot_1_1base__motor.html#a4e4f0ba9c71614508df1b713290e46ed',1,'robot::base_motor::setMotorVel()'],['../classrobot_1_1can__motor.html#abb1d04afbd630d18db9b0befe1ebd3df',1,'robot::can_motor::setMotorVel()'],['../namespacerobot.html#a724974bfa7bc871d135fee39560fc7ac',1,'robot::setMotorVel()']]], - ['setmousecallback_669',['setMouseCallback',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga89e7806b0a616f6f1d502bd8c183ad3e',1,'cv::setMouseCallback()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga89e7806b0a616f6f1d502bd8c183ad3e',1,'setMouseCallback()(Global Namespace)']]], - ['setmsgtype_670',['setMsgType',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#acceee66fe8604d9293e12b498578a41e',1,'cv::cuda::StereoBeliefPropagation']]], - ['setmultiline_671',['setMultiline',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#a9b1b38d0429011d5825cae92d0421233',1,'cv::Formatter']]], - ['setname_672',['setName',['../classcam_1_1Camera.html#a3474ed329bae10aff70af0e7f99cc51b',1,'cam::Camera']]], - ['setndummies_673',['setNDummies',['https://docs.opencv.org/4.2.0/df/d9a/classcv_1_1HistogramCostExtractor.html#a625258f2c9005af2f6745195830e5b4b',1,'cv::HistogramCostExtractor']]], - ['setneedplotline_674',['setNeedPlotLine',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a398e06229d7d7ae697863b1a299ab63d',1,'cv::plot::Plot2d']]], - ['setneighbors_675',['setNeighbors',['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html#ab225f7bf353ce8697a506eda10124a92',1,'cv::face::LBPHFaceRecognizer']]], - ['setnlevels_676',['setNLevels',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a73016bcb9692c5c3a7124f707689f667',1,'cv::ORB']]], - ['setnmixtures_677',['setNMixtures',['https://docs.opencv.org/4.2.0/d6/da7/classcv_1_1bgsegm_1_1BackgroundSubtractorMOG.html#a39b96d7ab5d7bc821c828639d2bf1594',1,'cv::bgsegm::BackgroundSubtractorMOG::setNMixtures()'],['https://docs.opencv.org/4.2.0/d1/dfe/classcv_1_1cuda_1_1BackgroundSubtractorMOG.html#a1bfab8e61c3199126a9133266147e83f',1,'cv::cuda::BackgroundSubtractorMOG::setNMixtures()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#ae049541aaa12c3a69d854c8f79a23ba3',1,'cv::BackgroundSubtractorMOG2::setNMixtures()']]], - ['setnoctavelayers_678',['setNOctaveLayers',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a45d8b1d6f4d7c1e82d5c76a5eca2a4eb',1,'cv::AKAZE::setNOctaveLayers()'],['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a2e924736db869f733e7892fdb1d9ce08',1,'cv::KAZE::setNOctaveLayers()'],['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html#acd9d6b3526a6ee7a98b2d86a03d28029',1,'cv::xfeatures2d::SURF::setNOctaveLayers()']]], - ['setnoctaves_679',['setNOctaves',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#abfd3d6fa82ea3e1301b83b07205762fe',1,'cv::AKAZE::setNOctaves()'],['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a986db4cdad6723c087f9d726bc85dc43',1,'cv::KAZE::setNOctaves()'],['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html#acc3e19253eab977a75f087151a65418e',1,'cv::xfeatures2d::SURF::setNOctaves()']]], - ['setnoisesigma_680',['setNoiseSigma',['https://docs.opencv.org/4.2.0/d6/da7/classcv_1_1bgsegm_1_1BackgroundSubtractorMOG.html#abdda60af4c063e40cf172ecd7e4f3262',1,'cv::bgsegm::BackgroundSubtractorMOG::setNoiseSigma()'],['https://docs.opencv.org/4.2.0/d1/dfe/classcv_1_1cuda_1_1BackgroundSubtractorMOG.html#a4c554b9f5e0264967a77a176488f8f14',1,'cv::cuda::BackgroundSubtractorMOG::setNoiseSigma()']]], - ['setnonmaxsuppression_681',['setNonMaxSuppression',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a916b81db081cc0102b595c8ffbd6d0c2',1,'cv::text::ERFilter']]], - ['setnonmaxsuppression_682',['setNonmaxSuppression',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#af61c25a92bed9fa6f6dcb8fdfdc2bc3c',1,'cv::AgastFeatureDetector::setNonmaxSuppression()'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a02ccd890c6ec44781efb05f36ec524e3',1,'cv::FastFeatureDetector::setNonmaxSuppression()']]], - ['setnormalarray_683',['setNormalArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a99ea6c9483ac94e8fb6588d94c6c4e1c',1,'cv::ogl::Arrays']]], - ['setnormflag_684',['setNormFlag',['https://docs.opencv.org/4.2.0/d0/d1c/classcv_1_1EMDHistogramCostExtractor.html#aea93ed360dbb425c0d590da0abc65d47',1,'cv::EMDHistogramCostExtractor::setNormFlag()'],['https://docs.opencv.org/4.2.0/df/d65/classcv_1_1NormHistogramCostExtractor.html#aca8175822047996563fe7892945848b7',1,'cv::NormHistogramCostExtractor::setNormFlag()']]], - ['setnormsigma0_685',['setNormSigma0',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#acda8f7bb5e3684bee7aef16bbb49345c',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['setnormsigma1_686',['setNormSigma1',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#aadad73ad59c63569b65bf3e8dbcb4a4d',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['setnrfeeds_687',['setNrFeeds',['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a2764dddb47b321b5c66b33b28f4e8571',1,'cv::detail::BlocksCompensator::setNrFeeds()'],['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html#a0e88972a7011b2a112e4fe20346d4f35',1,'cv::detail::ChannelsCompensator::setNrFeeds()'],['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#aa1b612c1f334592c084cdf057ce15805',1,'cv::detail::GainCompensator::setNrFeeds()']]], - ['setnrgainsfilteringiterations_688',['setNrGainsFilteringIterations',['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a96056be42faacbbc90c88d1a933f732c',1,'cv::detail::BlocksCompensator']]], - ['setnrplane_689',['setNrPlane',['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1cuda_1_1StereoConstantSpaceBP.html#abedc3ed02f0c19eeed836d07317b30a5',1,'cv::cuda::StereoConstantSpaceBP']]], - ['setnsamples_690',['setNSamples',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#aff347ac596a90bb3db2ceb91f19b5d87',1,'cv::BackgroundSubtractorKNN']]], - ['setnss_691',['setNSS',['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#aa33805361ab88495430ae21f5e779027',1,'cv::saliency::ObjectnessBING']]], - ['setnu_692',['setNu',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aa19ae35bcf07f52a4009ceeca583b113',1,'cv::ml::SVM']]], - ['setnull_693',['setNull',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a2399d72bf7dbd9f3589c69f32cbec306',1,'Eigen::AlignedBox']]], - ['setnumbands_694',['setNumBands',['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html#a2efd19181426ba017b23c24c88666188',1,'cv::detail::MultiBandBlender']]], - ['setnumclassifierrootnodes_695',['setNumClassifierRootNodes',['https://docs.opencv.org/4.2.0/d5/d37/structHaarStage64.html#a6d3532ce82316f4a0e7f4568638c4bba',1,'HaarStage64']]], - ['setnumcomponents_696',['setNumComponents',['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html#a8c7225de7d5ac05f6442abb8e88aac95',1,'cv::face::BasicFaceRecognizer']]], - ['setnumdisparities_697',['setNumDisparities',['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#a9d9082be76523c5f11fe6d21dce0afcc',1,'cv::cuda::DisparityBilateralFilter::setNumDisparities()'],['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#abacfe4e5760e86b48d0c19bd4106c2fc',1,'cv::StereoMatcher::setNumDisparities()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#af1b3153c4ad52991ffb45574f44fbf1a',1,'cv::stereo::StereoMatcher::setNumDisparities()']]], - ['setnumframes_698',['setNumFrames',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a83a88db22c8432215b3f9f2afe450efc',1,'cv::bgsegm::BackgroundSubtractorGMG::setNumFrames()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a3d33de36df6a96108b4d68ef1274081f',1,'cv::cuda::BackgroundSubtractorGMG::setNumFrames()']]], - ['setnumiterations_699',['setNumIterations',['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#ad30156f4e11110edc9601bf4768945ca',1,'cv::cuda::OpticalFlowDual_TVL1']]], - ['setnumiters_700',['setNumIters',['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1cuda_1_1DensePyrLKOpticalFlow.html#af4d64eff51c14f3c5f5ae9b25adf168c',1,'cv::cuda::DensePyrLKOpticalFlow::setNumIters()'],['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#afed083f8d80af4d4e67a4e21fb5841be',1,'cv::cuda::DisparityBilateralFilter::setNumIters()'],['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#aa3a3accde9da8c1d2ee7f3dc2697c059',1,'cv::FarnebackOpticalFlow::setNumIters()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#ace94e34039f31487a7f408f721ecf027',1,'cv::cuda::FarnebackOpticalFlow::setNumIters()'],['https://docs.opencv.org/4.2.0/d7/d05/classcv_1_1cuda_1_1SparsePyrLKOpticalFlow.html#af2d224ec011620f797b6e9c39b8e7368',1,'cv::cuda::SparsePyrLKOpticalFlow::setNumIters()'],['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#a600d2701f37f1247e1cba922c11eb827',1,'cv::cuda::StereoBeliefPropagation::setNumIters()']]], - ['setnumlevels_701',['setNumLevels',['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#a19152daa38e2f224da52ad15362360fa',1,'cv::FarnebackOpticalFlow::setNumLevels()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#aef2b85c540d247e2118709a23e251910',1,'cv::cuda::FarnebackOpticalFlow::setNumLevels()'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a7602088f3e792de196f8f7efcd9bd448',1,'cv::cuda::HOG::setNumLevels()'],['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#ac346c8b7f7f2e200e8874c3399bf1000',1,'cv::cuda::StereoBeliefPropagation::setNumLevels()']]], - ['setnumofangleline_702',['setNumOfAngleLine',['https://docs.opencv.org/4.2.0/d5/d97/classcv_1_1img__hash_1_1RadialVarianceHash.html#a177638c49d134ca7f0e5624b30c8bff6',1,'cv::img_hash::RadialVarianceHash']]], - ['setnumofoctaves_703',['setNumOfOctaves',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a5afb3050826b37027ca399e2e2308426',1,'cv::line_descriptor::BinaryDescriptor']]], - ['setnumscales_704',['setNumScales',['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#ad5e5e4fb4c6ab96e520cce317ec19da1',1,'cv::cuda::OpticalFlowDual_TVL1']]], - ['setnumsliciter_705',['setNumSlicIter',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#a15637f86ecbd5ef2e944810e75fbdaa8',1,'cv::hfs::HfsSegment']]], - ['setnumthreads_706',['setNumThreads',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae78625c3c2aa9e0b83ed31b73c6549c0',1,'cv::setNumThreads()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae78625c3c2aa9e0b83ed31b73c6549c0',1,'setNumThreads()(Global Namespace)']]], - ['setnumwarps_707',['setNumWarps',['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#a970b9e7ca756cc36ac706ebebf5995f0',1,'cv::cuda::OpticalFlowDual_TVL1']]], - ['setoctaves_708',['setOctaves',['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html#a589cbebff16f09783a1a902621efa7c1',1,'cv::BRISK']]], - ['setoffscreenrendering_709',['setOffScreenRendering',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a4d84fda69cb20ba20a77a1ae9d791610',1,'cv::viz::Viz3d']]], - ['setomega_710',['setOmega',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#a26008e93f8992623d405981ff2f47234',1,'cv::VariationalRefinement']]], - ['setones_711',['setOnes',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a250ef1b827e748f3f898fb2e55cb96e2',1,'Eigen::DenseBase::setOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a250ef1b827e748f3f898fb2e55cb96e2',1,'DenseBase< ArrayWrapper< ExpressionType > >::setOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a250ef1b827e748f3f898fb2e55cb96e2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::setOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a250ef1b827e748f3f898fb2e55cb96e2',1,'DenseBase< Solve< Decomposition, RhsType > >::setOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'Eigen::PlainObjectBase::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'Eigen::PlainObjectBase::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'Eigen::PlainObjectBase::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'Eigen::PlainObjectBase::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a4e6b3b2af8d0d6d06d14ec3c7092cffc',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::setOnes()']]], - ['setopenglcontext_712',['setOpenGlContext',['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html#ga1168ad91e634e3e34e2295a3ba9a6244',1,'cv::setOpenGlContext()'],['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html#ga1168ad91e634e3e34e2295a3ba9a6244',1,'setOpenGlContext()(Global Namespace)']]], - ['setopengldrawcallback_713',['setOpenGlDrawCallback',['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html#gaf80dcbc168a6ce40f6d1ad9d79a10bb8',1,'cv::setOpenGlDrawCallback()'],['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html#gaf80dcbc168a6ce40f6d1ad9d79a10bb8',1,'setOpenGlDrawCallback()(Global Namespace)']]], - ['setoptflowestimator_714',['setOptFlowEstimator',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#ab6613bb5eccf19f8cc13154ea8af39af',1,'cv::videostab::MotionInpainter']]], - ['setopticalflow_715',['setOpticalFlow',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ae24dac3128c6a5e9c2cc6cb3c7187757',1,'cv::superres::SuperResolution']]], - ['setopticalflowestimator_716',['setOpticalFlowEstimator',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a8ad21523860d819b2a84faeace4551c4',1,'cv::videostab::KeypointBasedMotionEstimator']]], - ['setoptimalparameters_717',['setOptimalParameters',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#ac9ead52ddcce2953c61335185de4178c',1,'cv::ml::SVMSGD']]], - ['setouteriterations_718',['setOuterIterations',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#a8fca0669fbe319e749fb55e360b0a015',1,'cv::cuda::BroxOpticalFlow::setOuterIterations()'],['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html#a77779ee478a3c6e05b7d4ce4ffe99c56',1,'cv::superres::BroxOpticalFlow::setOuterIterations()'],['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#af08c018bd0996abf910a7ce346c9ae7e',1,'cv::optflow::DualTVL1OpticalFlow::setOuterIterations()']]], - ['setouterradius_719',['setOuterRadius',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#abe0a9db459ed820ceb884cdb95712c12',1,'cv::ShapeContextDistanceExtractor']]], - ['setoutlierrejector_720',['setOutlierRejector',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#ade0c45a14e83a4f2b7a480f4459c47b9',1,'cv::videostab::KeypointBasedMotionEstimator']]], - ['setoutputfuncjacobianv_721',['setOutputFuncJacobianV',['../classfilters_1_1Output.html#a777261c2c893f5e02b2a11a400a7bafd',1,'filters::Output']]], - ['setoutputfuncjacobianx_722',['setOutputFuncJacobianX',['../classfilters_1_1Output.html#a78bbff2cb72b757d3d2443fcb5ecb718',1,'filters::Output']]], - ['setoutputmax_723',['setOutputMax',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a06962b042d9089366bc6347e608481b6',1,'cv::xphoto::SimpleWB']]], - ['setoutputmin_724',['setOutputMin',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a60d1e06b122747d416c4f1563167c740',1,'cv::xphoto::SimpleWB']]], - ['setoutshape_725',['setOutShape',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a10ea7f293d12413b4a897ddc6a8714ff',1,'cv::dnn::LSTMLayer']]], + ['scalar_103',['SCALAR',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa8f3d9a4b6a7b7f2c7afa61ca113d0db9',1,'SCALAR(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa8f3d9a4b6a7b7f2c7afa61ca113d0db9',1,'SCALAR(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa8f3d9a4b6a7b7f2c7afa61ca113d0db9',1,'SCALAR(Global Namespace)']]], + ['scalar_104',['Scalar',['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html',1,'cv::gapi::own::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#acd9b10692d7d726b28670e4d3a282fe8',1,'Eigen::AngleAxis::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a61035d40c9498bb1d47628cdd4946785',1,'Eigen::ComplexEigenSolver::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a9a8ee9df37ee1f90d0e53103c58683c0',1,'Eigen::ComplexSchur::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a9a8ee9df37ee1f90d0e53103c58683c0',1,'ComplexSchur< MatrixType >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5feed465b3a8e60c47e73ecce83e39a2',1,'Eigen::DenseBase::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5feed465b3a8e60c47e73ecce83e39a2',1,'DenseBase< ArrayWrapper< ExpressionType > >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5feed465b3a8e60c47e73ecce83e39a2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5feed465b3a8e60c47e73ecce83e39a2',1,'DenseBase< Solve< Decomposition, RhsType > >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a017d49fe0d59874b70a2fcf35e5aa373',1,'Eigen::EigenSolver::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#afb318d0b097ff8dd5a7410d31317ca47',1,'Eigen::GeneralizedEigenSolver::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a9420c36226cae7d92da8308a3f97ac2f',1,'Eigen::HessenbergDecomposition::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a9420c36226cae7d92da8308a3f97ac2f',1,'HessenbergDecomposition< MatrixType >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ac20c665ece0f197a712a2a39ae72e4e4',1,'Eigen::Rotation2D::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'Eigen::RotationBase::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'RotationBase< AngleAxis< _Scalar >, 3 >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'RotationBase< Derived, 3 >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#af9b43eac462d7aa70b018efd49c13ef4',1,'RotationBase< Rotation2D< _Scalar >, 2 >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a0bfcedf4245b6846007ca4f01e4feb1f',1,'Eigen::SelfAdjointEigenSolver::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af52acc0942ece2de9b6db4a99cc6656e',1,'Eigen::SelfAdjointView::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af52acc0942ece2de9b6db4a99cc6656e',1,'SelfAdjointView< const Derived, UpLo >::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a4e69ced9d651745b8ed4eda46f41795d',1,'Eigen::Transform::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#ad596bf21ced4b902cc242205df486e21',1,'Eigen::Translation::Scalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a04c4339f58f1210c5d4d34b1bd7ae283',1,'Eigen::UniformScaling::Scalar'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#afcfa42891883e0ae30694627e7f444fa',1,'cv::gapi::own::Scalar::Scalar()=default'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#a1d170debea8230c26f2b5a652479d2e2',1,'cv::gapi::own::Scalar::Scalar(double v0)'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#a6db773a6287163de63271d3ae7c267a0',1,'cv::gapi::own::Scalar::Scalar(double v0, double v1, double v2=0, double v3=0)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga599fe92e910c027be274233eccad7beb',1,'cv::Scalar'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga599fe92e910c027be274233eccad7beb',1,'Scalar(Global Namespace)']]], + ['scalar_20types_105',['Scalar types',['https://eigen.tuxfamily.org/dox/TopicScalarTypes.html',1,'']]], + ['scalar_20types_106',['Using custom scalar types',['https://eigen.tuxfamily.org/dox/TopicCustomizing_CustomScalar.html',1,'']]], + ['scalar_2ehpp_107',['scalar.hpp',['https://docs.opencv.org/4.2.0/d5/d4c/scalar_8hpp.html',1,'']]], + ['scalar_5f_108',['Scalar_',['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html',1,'cv::Scalar_< _Tp >'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae1f585cbf709bbce60762f802c571211',1,'cv::Scalar_::Scalar_()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae64e021266b9f7661f66a3c77d175c1f',1,'cv::Scalar_::Scalar_(_Tp v0, _Tp v1, _Tp v2=0, _Tp v3=0)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a3929afa654b588e2d9b2dde86060e689',1,'cv::Scalar_::Scalar_(_Tp v0)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a0224be57cfd1de9cca1edda69fc2e096',1,'cv::Scalar_::Scalar_(const Scalar_ &s)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a25e9ca0286c257b28cc23c34a34d715c',1,'cv::Scalar_::Scalar_(Scalar_ &&s) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a79f00ebc582fc7e231b4784fb1308c98',1,'cv::Scalar_::Scalar_(const Vec< _Tp2, cn > &v)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae1f585cbf709bbce60762f802c571211',1,'Scalar_< double >::Scalar_()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae64e021266b9f7661f66a3c77d175c1f',1,'Scalar_< double >::Scalar_(double v0, double v1, double v2=0, double v3=0)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a3929afa654b588e2d9b2dde86060e689',1,'Scalar_< double >::Scalar_(double v0)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a0224be57cfd1de9cca1edda69fc2e096',1,'Scalar_< double >::Scalar_(const Scalar_ &s)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a25e9ca0286c257b28cc23c34a34d715c',1,'Scalar_< double >::Scalar_(Scalar_ &&s) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a79f00ebc582fc7e231b4784fb1308c98',1,'Scalar_< double >::Scalar_(const Vec< _Tp2, cn > &v)']]], + ['scalar_5f_3c_20double_20_3e_109',['Scalar_< double >',['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html',1,'cv::Scalar_< double >'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html',1,'Scalar_< double >']]], + ['scalar_5fwrapper_110',['scalar_wrapper',['https://docs.opencv.org/4.2.0/d2/d64/structcv_1_1detail_1_1scalar__wrapper.html',1,'cv::detail::scalar_wrapper'],['https://docs.opencv.org/4.2.0/d2/d64/structcv_1_1detail_1_1scalar__wrapper.html#af5dfa2a66357359c7243439ea79e2be0',1,'cv::detail::scalar_wrapper::scalar_wrapper()']]], + ['scalar_5fwrapper_5focl_111',['scalar_wrapper_ocl',['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1detail_1_1scalar__wrapper__ocl.html',1,'cv::detail::scalar_wrapper_ocl'],['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1detail_1_1scalar__wrapper__ocl.html#adb93b18b25e7e063b3a9724ddf0259f7',1,'cv::detail::scalar_wrapper_ocl::scalar_wrapper_ocl()']]], + ['scalarbinaryoptraits_112',['ScalarBinaryOpTraits',['https://eigen.tuxfamily.org/dox/structEigen_1_1ScalarBinaryOpTraits.html',1,'Eigen']]], + ['scale_113',['scale',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html#af2774ac571ba4eec364f95e1e8c51e83',1,'cv::face::FacemarkAAM::Config::scale'],['https://docs.opencv.org/4.2.0/d3/d34/structcv_1_1DetectionROI.html#a52c1cbb159bc79148bcdb70ecdb1b590',1,'cv::DetectionROI::scale'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#aa51a2d6c9364ca64dce470874d2ab971',1,'cv::line_descriptor::LSDParam::scale'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1dnn_1_1PowerLayer.html#acf390557940b3935f4ffb9ad9b9e671f',1,'cv::dnn::PowerLayer::scale'],['https://docs.opencv.org/4.2.0/dc/d2c/structcv_1_1detail_1_1ProjectorBase.html#a4677711ed88bb184e14781e716efe4c3',1,'cv::detail::ProjectorBase::scale'],['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html#ae59ab0d4f97c5066b7922cfcfcb42abd',1,'cv::reg::Map::scale()'],['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#a070be78fef2a9320a8b7fe4dc40142b9',1,'cv::reg::MapAffine::scale()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#af53d8ef43de3cc8cfe4ac8308f9391f2',1,'cv::reg::MapProjec::scale()'],['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html#ad42ce1e14e2e170ce04d5c26fb2637c3',1,'cv::reg::MapShift::scale()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a8eea19fd9f6a6966a1a810acda22f93d',1,'Eigen::Transform::scale(const MatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a7757f5d9e708e625cbd936b19269b2c8',1,'Eigen::Transform::scale(const Scalar &s)'],['https://docs.opencv.org/4.2.0/d6/d84/namespacecv_1_1quality_1_1quality__utils.html#ae55d1c89ff5761730174745401162743',1,'cv::quality::quality_utils::scale()']]], + ['scale_20invariant_20feature_20transform_114',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], + ['scale_5ffactor_115',['scale_factor',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#a3e841dd1333e7bfd731f29868c65f3dc',1,'NCVBroxOpticalFlowDescriptor']]], + ['scale_5flr_116',['scale_lr',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a59995c780abd9d169dbb5e6ac70177e6',1,'cv::TrackerCSRT::Params']]], + ['scale_5fmodel_5fmax_5farea_117',['scale_model_max_area',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a99de20111cb8cdd851abd4e83f36bb87',1,'cv::TrackerCSRT::Params']]], + ['scale_5fsigma_5ffactor_118',['scale_sigma_factor',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a128ea11a74e3a6435843fd8519f573a9',1,'cv::TrackerCSRT::Params']]], + ['scale_5fstep_119',['scale_step',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a40502273aa746c2bd27d37bdffffe1ac',1,'cv::TrackerCSRT::Params']]], + ['scaleadd_120',['scaleAdd',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9e0845db4135f55dcf20227402f00d98',1,'cv::scaleAdd()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga9670da19276361e1681f69226e2071fb',1,'cv::cuda::scaleAdd()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9e0845db4135f55dcf20227402f00d98',1,'scaleAdd(InputArray src1, double alpha, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga9670da19276361e1681f69226e2071fb',1,'scaleAdd(InputArray src1, double alpha, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], + ['scalefactor_121',['scaleFactor',['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html#ac6991f5ba195b3141efbe2f93f2cd4b5',1,'cv::face::CParams::scaleFactor'],['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#a09e466966d8e1d37f7eb1200ecdf090a',1,'cv::DetectionBasedTracker::IDetector::scaleFactor']]], + ['scalelayer_122',['ScaleLayer',['https://docs.opencv.org/4.2.0/dd/dde/classcv_1_1dnn_1_1ScaleLayer.html',1,'cv::dnn']]], + ['scales_123',['scales',['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#a1c01ce9d2703384a1f937c276448d973',1,'cv::face::FacemarkAAM::Model::scales'],['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#ad3a5005b001e67945de5bcc66acb954b',1,'cv::face::FacemarkAAM::Params::scales']]], + ['scaling_124',['Scaling',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a109425bca2048c3df19249c04e73715c',1,'Eigen::Scaling(const MatrixBase< Derived > &coeffs)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#aafd4d881e7a6c2a68c1db03e261c767b',1,'Eigen::Scaling(const Scalar &sx, const Scalar &sy)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a162d759175d7c5214f33fefb30862815',1,'Eigen::Scaling(const Scalar &sx, const Scalar &sy, const Scalar &sz)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a76386154f2cdb77190759744830422d1',1,'Eigen::Scaling(const std::complex< RealScalar > &s)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad2e71727718ca788680b3aa9eb485f98',1,'Eigen::Scaling(double s)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a02918175ff75e5df9fd291cf5fc3fd1b',1,'Eigen::Scaling(float s)']]], + ['scalings_125',['scalingS',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a30d66dd77147a84ec3302e7d5fe5d924',1,'Eigen::IncompleteCholesky']]], + ['scan_20images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_126',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], + ['scan_2ehpp_127',['scan.hpp',['https://docs.opencv.org/4.2.0/d5/dc3/modules_2core_2include_2opencv2_2core_2cuda_2scan_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/de8/contrib_2modules_2cudev_2include_2opencv2_2cudev_2block_2scan_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/de6/contrib_2modules_2cudev_2include_2opencv2_2cudev_2warp_2scan_8hpp.html',1,'(Global Namespace)']]], + ['scan_5fis_128',['scan_is',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ad6c3f07029e022d82a459a12693fab50',1,'__ctype_abstract_base< wchar_t >::scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ad6c3f07029e022d82a459a12693fab50',1,'std::__ctype_abstract_base::scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ad6c3f07029e022d82a459a12693fab50',1,'std::ctype::scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#afb41b267fdd60faf7e4083606cb52a37',1,'std::ctype< char >::scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ad6c3f07029e022d82a459a12693fab50',1,'std::ctype< wchar_t >::scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ad6c3f07029e022d82a459a12693fab50',1,'std::ctype_byname::scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#afb41b267fdd60faf7e4083606cb52a37',1,'std::ctype_byname< char >::scan_is()']]], + ['scan_5fnot_129',['scan_not',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a083176729448869cdc7b5353299efac8',1,'__ctype_abstract_base< wchar_t >::scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a083176729448869cdc7b5353299efac8',1,'std::__ctype_abstract_base::scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a083176729448869cdc7b5353299efac8',1,'std::ctype::scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a8dface426b4233def1221b870319be44',1,'std::ctype< char >::scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a083176729448869cdc7b5353299efac8',1,'std::ctype< wchar_t >::scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a083176729448869cdc7b5353299efac8',1,'std::ctype_byname::scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a8dface426b4233def1221b870319be44',1,'std::ctype_byname< char >::scan_not()']]], + ['scanattr_130',['scanAttr',['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#ab0ef57b89bea5f94f7c343d2927a5acf',1,'cv::CvHaarFeatureParams::scanAttr()'],['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html#a1ff83b521ef1c8d5a83cd9fed4a89507',1,'cv::CvParams::scanAttr()']]], + ['scans_131',['SCANS',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a114713924ec05a0309f4df7e918c0324ac706a6a118a4a648fef8b2fca5950e2a',1,'cv::Stitcher']]], + ['scene_20reconstruction_132',['Scene Reconstruction',['https://docs.opencv.org/4.2.0/d4/d18/tutorial_sfm_scene_reconstruction.html',1,'']]], + ['scene_20text_20detection_133',['Scene Text Detection',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html',1,'']]], + ['scene_20text_20detection_20and_20recognition_134',['Scene Text Detection and Recognition',['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'']]], + ['scene_20text_20recognition_135',['Scene Text Recognition',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html',1,'']]], + ['scene_5faa_136',['SCENE_AA',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa4ff02bb7514152d154973ad7a061b756',1,'cv::ovis::SCENE_AA'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa4ff02bb7514152d154973ad7a061b756',1,'SCENE_AA(Global Namespace)']]], + ['scene_5finteractive_137',['SCENE_INTERACTIVE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aac3ceb82a09722fe7259f41e4c5a703d5',1,'cv::ovis::SCENE_INTERACTIVE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aac3ceb82a09722fe7259f41e4c5a703d5',1,'SCENE_INTERACTIVE(Global Namespace)']]], + ['scene_5foffscreen_138',['SCENE_OFFSCREEN',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa734b0f1d8ccd553b8a441214d673a996',1,'cv::ovis::SCENE_OFFSCREEN'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa734b0f1d8ccd553b8a441214d673a996',1,'SCENE_OFFSCREEN(Global Namespace)']]], + ['scene_5fsample_5fstep_139',['scene_sample_step',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a78629ddfb88fad7b33dd422ad7e4694d',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['scene_5fseparate_140',['SCENE_SEPARATE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa74b79923ba6b1b014585efe98a307e67',1,'cv::ovis::SCENE_SEPARATE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa74b79923ba6b1b014585efe98a307e67',1,'SCENE_SEPARATE(Global Namespace)']]], + ['scene_5fshow_5fcs_5fcross_141',['SCENE_SHOW_CS_CROSS',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa92776131bdb1f35563415df44da054e9',1,'cv::ovis::SCENE_SHOW_CS_CROSS'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ggab053860632281ae40811362b337b564aa92776131bdb1f35563415df44da054e9',1,'SCENE_SHOW_CS_CROSS(Global Namespace)']]], + ['scenesettings_142',['SceneSettings',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gab053860632281ae40811362b337b564a',1,'cv::ovis::SceneSettings'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gab053860632281ae40811362b337b564a',1,'SceneSettings(Global Namespace)']]], + ['schar_143',['schar',['https://docs.opencv.org/4.2.0/d1/d1b/group__core__hal__interface.html#ga0fd9ce9d735064461bebfe6037026093',1,]]], + ['scharr_144',['Scharr',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaa13106761eedf14798f37aa2d60404c9',1,'cv::Scharr()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaa13106761eedf14798f37aa2d60404c9',1,'Scharr()(Global Namespace)']]], + ['scharrx_5f_145',['scharrX_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f5120386a720e7582fb641f76e0d63e',1,'cv::cudev::scharrX_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f5120386a720e7582fb641f76e0d63e',1,'scharrX_()(Global Namespace)']]], + ['scharrxptr_146',['ScharrXPtr',['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1ScharrXPtr.html',1,'cv::cudev']]], + ['scharrxptr_147',['scharrXPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4ccc106934145cb8ad4d08c284c22d',1,'cv::cudev::scharrXPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4ccc106934145cb8ad4d08c284c22d',1,'scharrXPtr()(Global Namespace)']]], + ['scharrxptrsz_148',['ScharrXPtrSz',['https://docs.opencv.org/4.2.0/d2/d88/structcv_1_1cudev_1_1ScharrXPtrSz.html',1,'cv::cudev']]], + ['scharry_5f_149',['scharrY_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9132e741aae381582a25b9a989c9efea',1,'cv::cudev::scharrY_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9132e741aae381582a25b9a989c9efea',1,'scharrY_()(Global Namespace)']]], + ['scharryptr_150',['ScharrYPtr',['https://docs.opencv.org/4.2.0/d0/d70/structcv_1_1cudev_1_1ScharrYPtr.html',1,'cv::cudev']]], + ['scharryptr_151',['scharrYPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97a29ac775cd5fa765344be1738a51e1',1,'cv::cudev::scharrYPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97a29ac775cd5fa765344be1738a51e1',1,'scharrYPtr()(Global Namespace)']]], + ['scharryptrsz_152',['ScharrYPtrSz',['https://docs.opencv.org/4.2.0/dd/def/structcv_1_1cudev_1_1ScharrYPtrSz.html',1,'cv::cudev']]], + ['schedule_20your_20network_20for_20halide_20backend_153',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], + ['scheduleevent_154',['scheduleEvent',['../classutil_1_1PeriodicScheduler.html#abb81bec9a351199c3430515e8302ba62',1,'util::PeriodicScheduler']]], + ['scheduletelemetrypull_155',['scheduleTelemetryPull',['../namespacecan.html#a60a17e1ae5b26cd35f4322028435b6cc',1,'can']]], + ['scientific_156',['scientific',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'basic_ios< char, _Traits >::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'basic_iostream< char >::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'basic_istream< char >::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'basic_istream< char, _Traits >::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'basic_ostream< char >::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'basic_ostream< char, _Traits >::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_fstream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_ifstream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_ios::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_iostream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_istream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_istringstream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_ofstream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_ostream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_ostringstream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::basic_stringstream::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#af4966eeb93a789a84f9acd92375d8483',1,'std::ios_base::scientific'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a3286bebdde076d132d35c8fc79d6bdc4',1,'std::scientific()']]], + ['scoped_5fallocator_157',['scoped_allocator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00131.html',1,'']]], + ['scoped_5fallocator_5fadaptor_158',['scoped_allocator_adaptor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02747.html',1,'std']]], + ['scoped_5fallocator_5fadaptor_3c_20_5finnerhead_2c_20_5finnertail_2e_2e_2e_20_3e_159',['scoped_allocator_adaptor< _InnerHead, _InnerTail... >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02747.html',1,'']]], + ['scopedtimer_160',['ScopedTimer',['../classutil_1_1ScopedTimer.html',1,'util::ScopedTimer'],['../classutil_1_1ScopedTimer.html#a8a81591c83834cbb2e676172dd12d122',1,'util::ScopedTimer::ScopedTimer(std::string name)'],['../classutil_1_1ScopedTimer.html#a74471e10bbfdba342fe8e94131915349',1,'util::ScopedTimer::ScopedTimer()']]], + ['score_161',['score',['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1ximgproc_1_1Box.html#a087d310d7a7f472bc9540017a3ee49ee',1,'cv::ximgproc::Box::score'],['https://docs.opencv.org/4.2.0/df/da3/structcv_1_1linemod_1_1QuantizedPyramid_1_1Candidate.html#afbac5d07850cb1d7fc6f09cb2d09ffdf',1,'cv::linemod::QuantizedPyramid::Candidate::score'],['https://docs.opencv.org/4.2.0/d7/de4/structcv_1_1dpm_1_1DPMDetector_1_1ObjectDetection.html#a7dcc51aa5b6d36624cac2932bb284694',1,'cv::dpm::DPMDetector::ObjectDetection::score']]], + ['scoretype_162',['ScoreType',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a5f63b20f3802ea09319a934b353303e7',1,'cv::ORB']]], + ['scratch_5fhelper_163',['scratch_helper',['https://docs.opencv.org/4.2.0/db/df4/structcv_1_1detail_1_1scratch__helper.html',1,'cv::detail']]], + ['scratch_5fhelper_3c_20false_2c_20impl_2c_20ins_2e_2e_2e_20_3e_164',['scratch_helper< false, Impl, Ins... >',['https://docs.opencv.org/4.2.0/d0/d94/structcv_1_1detail_1_1scratch__helper_3_01false_00_01Impl_00_01Ins_8_8_8_01_4.html',1,'cv::detail']]], + ['scratch_5fhelper_3c_20true_2c_20impl_2c_20ins_2e_2e_2e_20_3e_165',['scratch_helper< true, Impl, Ins... >',['https://docs.opencv.org/4.2.0/dd/d8e/structcv_1_1detail_1_1scratch__helper_3_01true_00_01Impl_00_01Ins_8_8_8_01_4.html',1,'cv::detail']]], + ['sdk_166',['OpenCV4Android SDK',['https://docs.opencv.org/4.2.0/da/d2a/tutorial_O4A_SDK.html',1,'']]], + ['sdk_20compatible_20depth_20sensors_167',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], + ['seam_20estimation_168',['Seam Estimation',['https://docs.opencv.org/4.2.0/d9/d24/group__stitching__seam.html',1,'']]], + ['seam_5ffinders_2ehpp_169',['seam_finders.hpp',['https://docs.opencv.org/4.2.0/d1/d74/seam__finders_8hpp.html',1,'']]], + ['seamestimationresol_170',['seamEstimationResol',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ac559c3eb228614f9402ff3eba23a08f5',1,'cv::Stitcher']]], + ['seamfinder_171',['SeamFinder',['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html',1,'cv::detail']]], + ['seamfinder_172',['seamFinder',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a380c7c920f59047f2b25de7dc86f563d',1,'cv::Stitcher::seamFinder()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a850ad8689b42b43e10f8f45c39b0f797',1,'cv::Stitcher::seamFinder() const']]], + ['seamless_20cloning_173',['Seamless Cloning',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html',1,'']]], + ['seamlessclone_174',['seamlessClone',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#ga2bf426e4c93a6b1f21705513dfeca49d',1,'cv::seamlessClone()'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#ga2bf426e4c93a6b1f21705513dfeca49d',1,'seamlessClone(InputArray src, InputArray dst, InputArray mask, Point p, OutputArray blend, int flags)(Global Namespace)']]], + ['search_175',['Binary Search',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html',1,'']]], + ['search_176',['search',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga37e40c12374da3b76f2af5d2025b3018',1,'std::search(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gab76055789d1a598394f609cf19724220',1,'std::search(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2, _BinaryPredicate __predicate)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga37e40c12374da3b76f2af5d2025b3018',1,'search(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gab76055789d1a598394f609cf19724220',1,'search(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2, _BinaryPredicate __predicate)(Global Namespace)']]], + ['search_20in_20multi_20dimensional_20spaces_177',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], + ['search_2eh_178',['search.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00962.html',1,'']]], + ['search_5fminimal_5fn_179',['search_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a0a323f305cb24d5c555e35031553ef02',1,'__gnu_parallel::_Settings']]], + ['search_5fn_180',['search_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga98baadb721fcb143396118e3a678cd0e',1,'std::search_n(_ForwardIterator __first, _ForwardIterator __last, _Integer __count, const _Tp &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga4fd2241c480f56cb4fef2ae7da4d36b0',1,'std::search_n(_ForwardIterator __first, _ForwardIterator __last, _Integer __count, const _Tp &__val, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga98baadb721fcb143396118e3a678cd0e',1,'search_n(_ForwardIterator __first, _ForwardIterator __last, _Integer __count, const _Tp &__val)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga4fd2241c480f56cb4fef2ae7da4d36b0',1,'search_n(_ForwardIterator __first, _ForwardIterator __last, _Integer __count, const _Tp &__val, _BinaryPredicate __binary_pred)(Global Namespace)']]], + ['searchfactor_181',['searchFactor',['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html#aa9770acf6b2627cc66ae2a182f054937',1,'cv::TrackerSamplerCS::Params']]], + ['searchparams_182',['searchParams',['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#af7f49c47216e18e7bdbefeb73884b891',1,'cv::FlannBasedMatcher']]], + ['searchwinsize_183',['searchWinSize',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a1a0afdd15fab339b4c14379420c46e0e',1,'cv::TrackerSamplerCSC::Params']]], + ['second_184',['second',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'__gnu_parallel::_IteratorPair::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< _Bi_iter, _Bi_iter >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< _BiIter, _BiIter >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< _Iterator1, _Iterator2 >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< _RAIter, _RAIter >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< char, _TokenT >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< char, char >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'pair< entry_pointer, typename _Alloc::size_type >::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'std::pair::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'std::sub_match::second'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a91179413226db12e66346d3673b7835f',1,'sub_match< _Bi_iter >::second']]], + ['second_5fargument_5ftype_185',['second_argument_type',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'cv::cudev::binary_function::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< double, double, double >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< float, float, float >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< Predicate::first_argument_type, Predicate::second_argument_type, Predicate::result_type >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< schar, schar, float >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< schar, schar, schar >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< short, short, float >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< short, short, short >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< T1, T2, T1 >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< T1, T2, T2 >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< uchar, uchar, float >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< uchar, uchar, uchar >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< uint, uint, float >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< uint, uint, uint >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< ushort, ushort, float >::second_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7915bb2d619d3eb441b231edc33d704',1,'binary_function< ushort, ushort, ushort >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_cxx::project1st::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_cxx::project2nd::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_EqualFromLess::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_EqualTo::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_Less::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_Lexicographic::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_LexicographicReverse::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_Multiplies::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'__gnu_parallel::_Plus::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< __shared_ptr< _Tp, _Lp >, __shared_ptr< _Tp, _Lp >, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< __weak_ptr< _Tp, _Lp >, __weak_ptr< _Tp, _Lp >, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Arg1, _Arg2, _Arg1 >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Arg1, _Arg2, _Arg2 >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Predicate::first_argument_type, _Predicate::second_argument_type, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _T1, _T2, _Res >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _T1, _T2, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Tp *, _Arg, _Ret >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Tp *, _Tp *, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Tp, _Arg, _Ret >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Tp, _Tp, _Tp >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Tp, _Tp, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< _Tp1, _Tp2, _Result >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< const _Tp *, _Arg, _Ret >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< rope< _CharT, _Alloc >, rope< _CharT, _Alloc >, rope< _CharT, _Alloc > >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< shared_ptr< _Tp >, shared_ptr< _Tp >, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< std::pair< _T1, _T2 >, std::pair< _T1, _T2 >, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< value_type, value_type, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< void, void, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'binary_function< weak_ptr< _Tp >, weak_ptr< _Tp >, bool >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::_Maybe_unary_or_binary_function< _Res, _T1, _T2 >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::binary_function::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::binary_negate::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::const_mem_fun1_ref_t::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::const_mem_fun1_t::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::divides::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::equal_to::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::experimental::fundamentals_v2::owner_less< shared_ptr< _Tp > >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::experimental::fundamentals_v2::owner_less< weak_ptr< _Tp > >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::greater::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::greater_equal::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::less::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::less_equal::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::logical_and::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::logical_or::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::mem_fun1_ref_t::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::mem_fun1_t::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::minus::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::modulus::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::multiplies::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::not_equal_to::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::owner_less< shared_ptr< _Tp > >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::owner_less< void >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::owner_less< weak_ptr< _Tp > >::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::plus::second_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#aae0f69fe498930627177ff1f06d0ef9f',1,'std::pointer_to_binary_function::second_argument_type']]], + ['second_5ftype_186',['second_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'__gnu_parallel::_IteratorPair::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< _Bi_iter, _Bi_iter >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< _BiIter, _BiIter >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< _Iterator1, _Iterator2 >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< _RAIter, _RAIter >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< char, _TokenT >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< char, char >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'pair< entry_pointer, typename _Alloc::size_type >::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'std::pair::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'std::sub_match::second_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a6d205c1eab800cb27d82060d11d531a3',1,'sub_match< _Bi_iter >::second_type']]], + ['seconds_187',['seconds',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#a8ea2b45186343bcb86404b30815edf69',1,'std::chrono']]], + ['sectionnames_188',['sectionNames',['https://docs.opencv.org/4.2.0/db/dc1/group__datasets__track.html#gaae90bc58a7dfcdb4042a445d259e576b',1,'cv::datasets::sectionNames'],['https://docs.opencv.org/4.2.0/db/dc1/group__datasets__track.html#gaae90bc58a7dfcdb4042a445d259e576b',1,'sectionNames(Global Namespace)']]], + ['sectionsizes_189',['sectionSizes',['https://docs.opencv.org/4.2.0/db/dc1/group__datasets__track.html#ga19321b112ab3487fe3bd6ca88ae245e0',1,'cv::datasets::sectionSizes'],['https://docs.opencv.org/4.2.0/db/dc1/group__datasets__track.html#ga19321b112ab3487fe3bd6ca88ae245e0',1,'sectionSizes(Global Namespace)']]], + ['seed_190',['seed',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#adb96894164392bcd56297e52b2913e21',1,'cv::face::FacemarkLBF::Params::seed'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a11e6426e20d3ed617cf8fea9c3d7d2cf',1,'cv::RNG_MT19937::seed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a271b3af14e42c8d2eb9df443916b3e84',1,'std::discard_block_engine::seed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a0bbf8d919762d77cdb63f350a77c3853',1,'std::discard_block_engine::seed(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a03e7c33b907217f52a22d855b8f046d1',1,'std::discard_block_engine::seed(_Sseq &__q)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a68700cdbf6e7f53faa2cf86baf96d142',1,'std::independent_bits_engine::seed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a9d04c347df4ab52e8c1b8e6ab3a547de',1,'std::independent_bits_engine::seed(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a53bb5f059979eea1988908f2d767323e',1,'std::independent_bits_engine::seed(_Sseq &__q)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a7ef79cd68e42013fb35269be5d130797',1,'std::linear_congruential_engine::seed(_Sseq &__q) -> _If_seed_seq< _Sseq >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#aa0c9986cf366682ff3311bca8021ee19',1,'std::linear_congruential_engine::seed(result_type __s=default_seed)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#aac948b8fbdb3540985f0e23ff984ef3c',1,'std::linear_congruential_engine::seed(_Sseq &__q)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a6694efb9e8aeb7591edfa921d9b9b660',1,'std::shuffle_order_engine::seed()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#ae8b8fd06503a7059d60289378438f9d2',1,'std::shuffle_order_engine::seed(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a2a6b36b00d80a1444a393cb4db444c2a',1,'std::shuffle_order_engine::seed(_Sseq &__q)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a5629eb85bb95f545575b9b08bacafda4',1,'std::subtract_with_carry_engine::seed(result_type __sd=default_seed)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#ab547f8ba4458122672f929f3fef4026c',1,'std::subtract_with_carry_engine::seed(_Sseq &__q)']]], + ['seed_5fseq_191',['seed_seq',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06515.html',1,'std::seed_seq'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06515.html#a125513e09d016c8a95dba3ce653c8001',1,'std::seed_seq::seed_seq()']]], + ['seeds_2ehpp_192',['seeds.hpp',['https://docs.opencv.org/4.2.0/d5/daf/seeds_8hpp.html',1,'']]], + ['seek_193',['seek',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ab4528351272b931dfc8d471c50ea1115',1,'cv::MatConstIterator::seek(ptrdiff_t ofs, bool relative=false)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#acf82c2ab7fe9e81961db497909cee953',1,'cv::MatConstIterator::seek(const int *_idx, bool relative=false)']]], + ['seekdir_194',['seekdir',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'basic_ios< char, _Traits >::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'basic_iostream< char >::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'basic_istream< char >::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'basic_istream< char, _Traits >::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'basic_ostream< char >::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'basic_ostream< char, _Traits >::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_fstream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_ifstream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_ios::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_iostream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_istream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_istringstream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_ofstream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_ostream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_ostringstream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::basic_stringstream::seekdir'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac19bbe98949795f6038952b6c7759a0a',1,'std::ios_base::seekdir']]], + ['seekend_195',['seekEnd',['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ad6e372a9006ca9a8838825a6ac98b45d',1,'cv::SparseMatConstIterator']]], + ['seekg_196',['seekg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'basic_iostream< char >::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'basic_iostream< char >::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'basic_iostream< char >::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'basic_iostream< char >::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'basic_istream< char >::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'basic_istream< char >::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'basic_istream< char >::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'basic_istream< char >::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'basic_istream< char, _Traits >::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'basic_istream< char, _Traits >::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'basic_istream< char, _Traits >::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'basic_istream< char, _Traits >::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_fstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_fstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_fstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_fstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_ifstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_ifstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_ifstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_ifstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_iostream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_iostream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_iostream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_iostream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_istream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_istream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_istream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_istream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_istringstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_istringstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_istringstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_istringstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_stringstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_stringstream::seekg(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a06aeddb9416bfb47fe49ef00c8980eed',1,'std::basic_stringstream::seekg(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#abb1d9cd4a2753ba8571d438b78037353',1,'std::basic_stringstream::seekg(off_type, ios_base::seekdir)']]], + ['seekoff_197',['seekoff',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0152beebcac8c9542b6b0efe3de5bbfb',1,'__gnu_cxx::enc_filebuf::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0152beebcac8c9542b6b0efe3de5bbfb',1,'__gnu_cxx::stdio_filebuf::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad6d5177e376efdb0dccf62890eebc9b0',1,'__gnu_cxx::stdio_sync_filebuf::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0152beebcac8c9542b6b0efe3de5bbfb',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0152beebcac8c9542b6b0efe3de5bbfb',1,'basic_filebuf< char_type, traits_type >::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad6d5177e376efdb0dccf62890eebc9b0',1,'basic_streambuf< _Elem, _Tr >::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad6d5177e376efdb0dccf62890eebc9b0',1,'basic_streambuf< char, _Traits >::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad6d5177e376efdb0dccf62890eebc9b0',1,'basic_streambuf< char, char_traits< char > >::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0152beebcac8c9542b6b0efe3de5bbfb',1,'std::basic_filebuf::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad6d5177e376efdb0dccf62890eebc9b0',1,'std::basic_streambuf::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a87ffed7ed9940e5952303b31be0b6a11',1,'std::basic_stringbuf::seekoff()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad6d5177e376efdb0dccf62890eebc9b0',1,'std::wbuffer_convert::seekoff()']]], + ['seekp_198',['seekp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'basic_iostream< char >::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'basic_iostream< char >::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'basic_ostream< char >::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'basic_ostream< char >::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'basic_ostream< char, _Traits >::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'basic_ostream< char, _Traits >::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'std::basic_fstream::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'std::basic_fstream::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'std::basic_iostream::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'std::basic_iostream::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'std::basic_ofstream::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'std::basic_ofstream::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'std::basic_ostream::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'std::basic_ostream::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'std::basic_ostringstream::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'std::basic_ostringstream::seekp(off_type, ios_base::seekdir)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#abb04da4da073ece1c0222004b6f3207b',1,'std::basic_stringstream::seekp(pos_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a6c7c5283e1f9b0a49c85f1f81c976226',1,'std::basic_stringstream::seekp(off_type, ios_base::seekdir)']]], + ['seekpos_199',['seekpos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a91365d684bb298cb7ad42e3c73cd0252',1,'__gnu_cxx::enc_filebuf::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a91365d684bb298cb7ad42e3c73cd0252',1,'__gnu_cxx::stdio_filebuf::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a008405d586f640e109c7ab7bf424aa39',1,'__gnu_cxx::stdio_sync_filebuf::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a91365d684bb298cb7ad42e3c73cd0252',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a91365d684bb298cb7ad42e3c73cd0252',1,'basic_filebuf< char_type, traits_type >::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a008405d586f640e109c7ab7bf424aa39',1,'basic_streambuf< _Elem, _Tr >::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a008405d586f640e109c7ab7bf424aa39',1,'basic_streambuf< char, _Traits >::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a008405d586f640e109c7ab7bf424aa39',1,'basic_streambuf< char, char_traits< char > >::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a91365d684bb298cb7ad42e3c73cd0252',1,'std::basic_filebuf::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a008405d586f640e109c7ab7bf424aa39',1,'std::basic_streambuf::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a763bee40dfc04e2ee2816e322c3af297',1,'std::basic_stringbuf::seekpos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a008405d586f640e109c7ab7bf424aa39',1,'std::wbuffer_convert::seekpos()']]], + ['segment_200',['segment',['https://docs.opencv.org/4.2.0/da/dce/classcv_1_1dnn_1_1SegmentationModel.html#ab5542c90d35cfbc3fa32095aa77b2a95',1,'cv::dnn::SegmentationModel']]], + ['segmentation_201',['Segmentation',['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html',1,'Background Segmentation'],['https://docs.opencv.org/4.2.0/dc/d29/group__hfs.html',1,'Hierarchical Feature Selection for Efficient Image Segmentation'],['https://docs.opencv.org/4.2.0/d3/d2d/group__datasets__is.html',1,'Image Segmentation']]], + ['segmentation_202',['Image segmentation',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html',1,'']]], + ['segmentation_20by_20a_20gradient_20structure_20tensor_203',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], + ['segmentation_20methods_204',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], + ['segmentation_20on_20g_20api_205',['Porting anisotropic image segmentation on G-API',['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'']]], + ['segmentation_20with_20distance_20transform_20and_20watershed_20algorithm_206',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], + ['segmentation_20with_20watershed_20algorithm_207',['Segmentation with Watershed Algorithm',['https://docs.opencv.org/4.2.0/d3/db4/tutorial_py_watershed.html',1,'Image Segmentation with Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d7/d1c/tutorial_js_watershed.html',1,'Image Segmentation with Watershed Algorithm']]], + ['segmentation_2ehpp_208',['segmentation.hpp',['https://docs.opencv.org/4.2.0/dc/dd0/segmentation_8hpp.html',1,'']]], + ['segmentationmodel_209',['SegmentationModel',['https://docs.opencv.org/4.2.0/da/dce/classcv_1_1dnn_1_1SegmentationModel.html',1,'cv::dnn::SegmentationModel'],['https://docs.opencv.org/4.2.0/da/dce/classcv_1_1dnn_1_1SegmentationModel.html#ae4f2c95310ea7213bb6b889160e21fd7',1,'cv::dnn::SegmentationModel::SegmentationModel(const String &model, const String &config="")'],['https://docs.opencv.org/4.2.0/da/dce/classcv_1_1dnn_1_1SegmentationModel.html#a972b1ee7ce7694b2fe3b6db3bf6f6a29',1,'cv::dnn::SegmentationModel::SegmentationModel(const Net &network)']]], + ['segmentationparameters_210',['SegmentationParameters',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html',1,'cv::bioinspired::SegmentationParameters'],['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#accbb5b7e2ada944a4c14d1077599484d',1,'cv::bioinspired::SegmentationParameters::SegmentationParameters()']]], + ['segmentmotion_211',['segmentMotion',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga9eea50c233a0a6d7fecdd2c66821eed5',1,'cv::motempl::segmentMotion()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga9eea50c233a0a6d7fecdd2c66821eed5',1,'segmentMotion()(Global Namespace)']]], + ['select_212',['Select',['https://eigen.tuxfamily.org/dox/classEigen_1_1Select.html',1,'Eigen']]], + ['select_213',['select',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65e78cfcbc9852e6923bebff4323ddca',1,'Eigen::DenseBase::select(const DenseBase< ThenDerived > &thenMatrix, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a57ef09a843004095f84c198dd145641b',1,'Eigen::DenseBase::select(const DenseBase< ThenDerived > &thenMatrix, const typename ThenDerived::Scalar &elseScalar) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e8e78c75887d4539071a0b7a61ca103',1,'Eigen::DenseBase::select(const typename ElseDerived::Scalar &thenScalar, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65e78cfcbc9852e6923bebff4323ddca',1,'DenseBase< ArrayWrapper< ExpressionType > >::select(const DenseBase< ThenDerived > &thenMatrix, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a57ef09a843004095f84c198dd145641b',1,'DenseBase< ArrayWrapper< ExpressionType > >::select(const DenseBase< ThenDerived > &thenMatrix, const typename ThenDerived::Scalar &elseScalar) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e8e78c75887d4539071a0b7a61ca103',1,'DenseBase< ArrayWrapper< ExpressionType > >::select(const typename ElseDerived::Scalar &thenScalar, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65e78cfcbc9852e6923bebff4323ddca',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::select(const DenseBase< ThenDerived > &thenMatrix, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a57ef09a843004095f84c198dd145641b',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::select(const DenseBase< ThenDerived > &thenMatrix, const typename ThenDerived::Scalar &elseScalar) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e8e78c75887d4539071a0b7a61ca103',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::select(const typename ElseDerived::Scalar &thenScalar, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a65e78cfcbc9852e6923bebff4323ddca',1,'DenseBase< Solve< Decomposition, RhsType > >::select(const DenseBase< ThenDerived > &thenMatrix, const DenseBase< ElseDerived > &elseMatrix) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a57ef09a843004095f84c198dd145641b',1,'DenseBase< Solve< Decomposition, RhsType > >::select(const DenseBase< ThenDerived > &thenMatrix, const typename ThenDerived::Scalar &elseScalar) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9e8e78c75887d4539071a0b7a61ca103',1,'DenseBase< Solve< Decomposition, RhsType > >::select(const typename ElseDerived::Scalar &thenScalar, const DenseBase< ElseDerived > &elseMatrix) const'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga41ca710c7c457ecc8b32b5a3d9f12634',1,'cv::gapi::select()'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga41ca710c7c457ecc8b32b5a3d9f12634',1,'select()(Global Namespace)']]], + ['select1st_214',['select1st',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09171.html',1,'__gnu_cxx']]], + ['select2nd_215',['select2nd',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09175.html',1,'__gnu_cxx']]], + ['select_5fkeyframes_216',['select_keyframes',['https://docs.opencv.org/4.2.0/d1/d61/classcv_1_1sfm_1_1libmv__ReconstructionOptions.html#a1f7fae6ec918e2b1fb94b122aeb1cb9d',1,'cv::sfm::libmv_ReconstructionOptions']]], + ['select_5fon_5fcontainer_5fcopy_5fconstruction_217',['select_on_container_copy_construction',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ac324d9065f45f7ae2dd1e0014c73f218',1,'__alloc_traits< _Tp_alloc_type >::select_on_container_copy_construction()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ac324d9065f45f7ae2dd1e0014c73f218',1,'__gnu_cxx::__alloc_traits::select_on_container_copy_construction()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ac324d9065f45f7ae2dd1e0014c73f218',1,'allocator_traits< _Tp_alloc_type >::select_on_container_copy_construction()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ac324d9065f45f7ae2dd1e0014c73f218',1,'std::allocator_traits::select_on_container_copy_construction()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#abba21b363dcc1a741ea3f6047e491388',1,'std::allocator_traits< allocator< _Tp > >::select_on_container_copy_construction()']]], + ['selectbestclassifier_218',['selectBestClassifier',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html#a971d1b4ec5c65f3ac729ce3bb70f053b',1,'cv::BaseClassifier']]], + ['selectif_219',['SelectIf',['https://docs.opencv.org/4.2.0/d8/d1b/structcv_1_1cudev_1_1SelectIf.html',1,'cv::cudev']]], + ['selectif_3c_20false_2c_20thentype_2c_20elsetype_20_3e_220',['SelectIf< false, ThenType, ElseType >',['https://docs.opencv.org/4.2.0/dd/da7/structcv_1_1cudev_1_1SelectIf_3_01false_00_01ThenType_00_01ElseType_01_4.html',1,'cv::cudev']]], + ['selection_221',['selection',['https://docs.opencv.org/4.2.0/d7/da2/classcv_1_1TrackerFeature.html#af07aacc3c887382f5ad72c2f38dcb5a8',1,'cv::TrackerFeature::selection()'],['https://docs.opencv.org/4.2.0/d3/d4c/classcv_1_1TrackerFeatureFeature2d.html#aa46c143187e3f40c75bbf8f61c207a98',1,'cv::TrackerFeatureFeature2d::selection()'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a68a590ce3590ca57b29a3d17db81d7d9',1,'cv::TrackerFeatureHAAR::selection()'],['https://docs.opencv.org/4.2.0/d2/da3/classcv_1_1TrackerFeatureHOG.html#af054f2d656b3d4f36b7b880629e64dc7',1,'cv::TrackerFeatureHOG::selection()'],['https://docs.opencv.org/4.2.0/dc/d73/classcv_1_1TrackerFeatureLBP.html#a5e3654d875f90a2ea8489037ea3fe135',1,'cv::TrackerFeatureLBP::selection()'],['https://docs.opencv.org/4.2.0/dc/da7/classcv_1_1TrackerFeatureSet.html#aa770a9d343671844657077cb79dba235',1,'cv::TrackerFeatureSet::selection()']]], + ['selection_20for_20efficient_20image_20segmentation_222',['Hierarchical Feature Selection for Efficient Image Segmentation',['https://docs.opencv.org/4.2.0/dc/d29/group__hfs.html',1,'']]], + ['selectivesearchsegmentation_223',['SelectiveSearchSegmentation',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html',1,'cv::ximgproc::segmentation']]], + ['selectivesearchsegmentationstrategy_224',['SelectiveSearchSegmentationStrategy',['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategy.html',1,'cv::ximgproc::segmentation']]], + ['selectivesearchsegmentationstrategycolor_225',['SelectiveSearchSegmentationStrategyColor',['https://docs.opencv.org/4.2.0/de/dab/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategyColor.html',1,'cv::ximgproc::segmentation']]], + ['selectivesearchsegmentationstrategyfill_226',['SelectiveSearchSegmentationStrategyFill',['https://docs.opencv.org/4.2.0/d9/db3/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategyFill.html',1,'cv::ximgproc::segmentation']]], + ['selectivesearchsegmentationstrategymultiple_227',['SelectiveSearchSegmentationStrategyMultiple',['https://docs.opencv.org/4.2.0/d8/d8e/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategyMultiple.html',1,'cv::ximgproc::segmentation']]], + ['selectivesearchsegmentationstrategysize_228',['SelectiveSearchSegmentationStrategySize',['https://docs.opencv.org/4.2.0/d0/d10/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategySize.html',1,'cv::ximgproc::segmentation']]], + ['selectivesearchsegmentationstrategytexture_229',['SelectiveSearchSegmentationStrategyTexture',['https://docs.opencv.org/4.2.0/d6/d17/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategyTexture.html',1,'cv::ximgproc::segmentation']]], + ['selectrandomsubset_230',['selectRandomSubset',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga73d6882563516f276bda76365d4619ee',1,'cv::detail::selectRandomSubset()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga73d6882563516f276bda76365d4619ee',1,'selectRandomSubset()(Global Namespace)']]], + ['selectroi_231',['selectROI',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8daf4730d3adf7035b6de9be4c469af5',1,'cv::selectROI(const String &windowName, InputArray img, bool showCrosshair=true, bool fromCenter=false)'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga2e2256794d0c88f4cfc4fdd7890c9794',1,'cv::selectROI(InputArray img, bool showCrosshair=true, bool fromCenter=false)'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8daf4730d3adf7035b6de9be4c469af5',1,'selectROI(const String &windowName, InputArray img, bool showCrosshair=true, bool fromCenter=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga2e2256794d0c88f4cfc4fdd7890c9794',1,'selectROI(InputArray img, bool showCrosshair=true, bool fromCenter=false)(Global Namespace)']]], + ['selectrois_232',['selectROIs',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga0f11fad74a6432b8055fb21621a0f893',1,'cv::selectROIs()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga0f11fad74a6432b8055fb21621a0f893',1,'selectROIs()(Global Namespace)']]], + ['selectscatteredfeatures_233',['selectScatteredFeatures',['https://docs.opencv.org/4.2.0/d7/d6f/classcv_1_1linemod_1_1QuantizedPyramid.html#a8c9546d287bf178f6aab3d8067066b2a',1,'cv::linemod::QuantizedPyramid']]], + ['selfadjoint_234',['SelfAdjoint',['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cdacf9ccb2016f8b9c0f3268f05a1e75821',1,'Eigen::SelfAdjoint'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cdacf9ccb2016f8b9c0f3268f05a1e75821',1,'SelfAdjoint(Global Namespace)']]], + ['selfadjointeigensolver_235',['SelfAdjointEigenSolver',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html',1,'Eigen::SelfAdjointEigenSolver< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a8f3dde67faa971dd97e8141617762326',1,'Eigen::SelfAdjointEigenSolver::SelfAdjointEigenSolver()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a7d8cba55cce60cb3931148208cc5bd0e',1,'Eigen::SelfAdjointEigenSolver::SelfAdjointEigenSolver(const EigenBase< InputType > &matrix, int options=ComputeEigenvectors)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a825919ee41153a19910c72d1bff31c8e',1,'Eigen::SelfAdjointEigenSolver::SelfAdjointEigenSolver(Index size)']]], + ['selfadjointview_236',['SelfAdjointView',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html',1,'Eigen']]], + ['selfadjointview_237',['selfadjointView',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad446541377593656c1399862fe6a0f94',1,'Eigen::MatrixBase::selfadjointView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a67eb836f331d9b567e7f36ec0782fa07',1,'Eigen::MatrixBase::selfadjointView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad446541377593656c1399862fe6a0f94',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::selfadjointView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a67eb836f331d9b567e7f36ec0782fa07',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::selfadjointView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad446541377593656c1399862fe6a0f94',1,'MatrixBase< Solve< Decomposition, RhsType > >::selfadjointView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a67eb836f331d9b567e7f36ec0782fa07',1,'MatrixBase< Solve< Decomposition, RhsType > >::selfadjointView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a408d1e6601f83ae8b7cd5edc8ad313a5',1,'Eigen::TriangularView::selfadjointView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a669d39567c1a2f805582c7538f2752b5',1,'Eigen::TriangularView::selfadjointView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a408d1e6601f83ae8b7cd5edc8ad313a5',1,'TriangularView< const Derived, Mode >::selfadjointView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a669d39567c1a2f805582c7538f2752b5',1,'TriangularView< const Derived, Mode >::selfadjointView() const']]], + ['selfadjointview_3c_20const_20derived_2c_20uplo_20_3e_238',['SelfAdjointView< const Derived, UpLo >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html',1,'']]], + ['sendcanpacket_239',['sendCANPacket',['../namespacecan.html#a3e4a4acc87fbf8cfad2a9a9252811314',1,'can']]], + ['sendjson_240',['sendJSON',['../classnet_1_1websocket_1_1SingleClientWSServer.html#a1c61e5d20850e351ee97760a0c65e13b',1,'net::websocket::SingleClientWSServer']]], + ['sendrawstring_241',['sendRawString',['../classnet_1_1websocket_1_1SingleClientWSServer.html#a96d029a7fcc48f6339b896ee17c64343',1,'net::websocket::SingleClientWSServer']]], + ['sensitivity_242',['sensitivity',['https://docs.opencv.org/4.2.0/df/d5b/classcv_1_1videostab_1_1WeightingDeblurer.html#a78287845b6cf7f6a3e3c9c6ce90d540c',1,'cv::videostab::WeightingDeblurer']]], + ['sensor_5ft_243',['sensor_t',['../structcan_1_1motor_1_1sensor__t.html',1,'can::motor']]], + ['sensors_244',['sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors'],['https://docs.opencv.org/4.2.0/d7/d6f/tutorial_kinect_openni.html',1,'Using Kinect and other OpenNI compatible depth sensors']]], + ['sentry_245',['sentry',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02491.html',1,'std::basic_istream< _CharT, _Traits >::sentry'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02639.html',1,'std::basic_ostream< _CharT, _Traits >::sentry'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02491.html#a2fc3c8f08453fb26ed43694eaeab5493',1,'std::basic_istream::sentry::sentry()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02639.html#ae972dd47564726ff41e6be700820719c',1,'std::basic_ostream::sentry::sentry()']]], + ['senz3d_20and_20other_20intel_20perceptual_20computing_20sdk_20compatible_20depth_20sensors_246',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], + ['separable_20data_247',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], + ['separatedetectionwork_248',['separateDetectionWork',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#aae0c0bd5a104bb1c57632e5187f32fe8',1,'cv::DetectionBasedTracker']]], + ['sepfilter_249',['sepFilter',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga546a47a68c08bb49bb40825780ffc2e8',1,'cv::gapi::sepFilter()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga546a47a68c08bb49bb40825780ffc2e8',1,'sepFilter()(Global Namespace)']]], + ['sepfilter2d_250',['sepFilter2D',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga910e29ff7d7b105057d1625a4bf6318d',1,'cv::sepFilter2D()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga9bc59a448bd61e38e0383daf1572b12d',1,'cv::hal::sepFilter2D()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga910e29ff7d7b105057d1625a4bf6318d',1,'sepFilter2D(InputArray src, OutputArray dst, int ddepth, InputArray kernelX, InputArray kernelY, Point anchor=Point(-1,-1), double delta=0, int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga9bc59a448bd61e38e0383daf1572b12d',1,'sepFilter2D(int stype, int dtype, int ktype, uchar *src_data, size_t src_step, uchar *dst_data, size_t dst_step, int width, int height, int full_width, int full_height, int offset_x, int offset_y, uchar *kernelx_data, int kernelx_len, uchar *kernely_data, int kernely_len, int anchor_x, int anchor_y, double delta, int borderType)(Global Namespace)']]], + ['seq_251',['SEQ',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45aa359c2282183738d11a665035a1a67bb',1,'cv::FileNode']]], + ['seq_252',['seq',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad87fbafd4a91f5c1ed6a768987a1b74d',1,'Eigen::seq(FirstType f, LastType l)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a0c04400203ca9b414e13c9c721399969',1,'Eigen::seq(FirstType f, LastType l, IncrType incr)']]], + ['seqn_253',['seqN',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ade9f918902511b83512a8e6dde5cad7a',1,'Eigen::seqN(FirstType first, SizeType size)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a3a3c346d2a61d1e8e86e6fb4cf57fbda',1,'Eigen::seqN(FirstType first, SizeType size, IncrType incr)']]], + ['sequence_5ftag_254',['sequence_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11211.html',1,'__gnu_pbds']]], + ['sequences_255',['Sequences',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01470.html',1,'']]], + ['sequential_256',['sequential',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a76f6cbf29b1b8d57762cce1ed9bd01a8a7e6aa054fd848be925726fcf7b4eb3ce',1,'__gnu_parallel']]], + ['sequential_5ftag_257',['sequential_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09703.html',1,'__gnu_parallel']]], + ['set_258',['set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08803.html',1,'std::__debug::set< _Key, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08939.html',1,'std::__profile::set< _Key, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html',1,'std::set< _Key, _Compare, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00134.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a97f006742147ad210284e401673d0887',1,'cv::DescriptorMatcher::DescriptorCollection::set()'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a1fa471fbcc4f193ac76ee42cbf3b9d6e',1,'cv::ocl::Device::set()'],['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html#accbd3f4f8ce6b4a04891a15683c58730',1,'cv::dnn::Dict::set()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a7d1878c70f71fa758d2a7e72944ae01b',1,'cv::ocl::Kernel::set(int i, const void *value, size_t sz)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a77a6c6c3b21e1b1a9259c541f88b48b7',1,'cv::ocl::Kernel::set(int i, const Image2D &image2D)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#aee13a6f7c087c5611048d97e4b833c56',1,'cv::ocl::Kernel::set(int i, const UMat &m)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a6130a2a2f7d6cc61c234c1f062630734',1,'cv::ocl::Kernel::set(int i, const KernelArg &arg)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#aff26198735930885f1f78e1990937475',1,'cv::ocl::Kernel::set(int i, const _Tp &value)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a8c6d8c2d37505b5ca61ffd4bb54e9a7c',1,'cv::VideoCapture::set()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a7ba668f440d8af5e1a92df58b2475816',1,'cv::VideoWriter::set()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ab8315853244a863923059790ac776299',1,'__gnu_parallel::_Settings::set()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a11172e92c3d43b0241294f0fabeb176c',1,'std::bitset::set() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a8e5de5f2693d0f873982c7e7435ecdb8',1,'std::bitset::set(size_t __position, bool __val=true)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a907d82d36716f9e488b991958f58f6aa',1,'std::set::set()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aed34d26628e845f2b7e0eb45959ef0fc',1,'std::set::set(const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a5c24e6efdb6526f5a28e7c54af8e3e15',1,'std::set::set(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a0b099bbbac6aef91b91c671c3e231979',1,'std::set::set(_InputIterator __first, _InputIterator __last, const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#adb05c13eee25271b092edf7878379cb5',1,'std::set::set(const set &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2ab389e91f3dc70a3e9a9e69067283ae',1,'std::set::set(set &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#acdf4b44f5a2f222c735237d763b89eaa',1,'std::set::set(initializer_list< value_type > __l, const _Compare &__comp=_Compare(), const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a943aa95cb4e637b9b3199cb63cd247b0',1,'std::set::set(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a06c8c1519399c9811fd0bfe2702f5c3b',1,'std::set::set(const set &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a5ef0930efbfe6211c06de5d4e4e7a253',1,'std::set::set(set &&__x, const allocator_type &__a) noexcept(is_nothrow_copy_constructible< _Compare >::value &&_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aaf9732d21b9343b12f3117fe3b87a6f3',1,'std::set::set(initializer_list< value_type > __l, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ac33c85b1fbf245c21fe0965b7e7eca59',1,'std::set::set(_InputIterator __first, _InputIterator __last, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#af0f0684a054caff643d9599dcc821b80',1,'std::tr2::dynamic_bitset::set()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a5d26ab2d19fd14a7a70c3d5af6b922be',1,'std::tr2::dynamic_bitset::set(size_type __pos, bool __val=true)']]], + ['set_20operations_259',['Set Operations',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html',1,'']]], + ['set16fprecision_260',['set16fPrecision',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#a90a0c3deed29ba559fa70d260e4d3030',1,'cv::Formatter']]], + ['set32fprecision_261',['set32fPrecision',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#aeab7d90ed6e65db4c9eb812db650154d',1,'cv::Formatter']]], + ['set64fprecision_262',['set64fPrecision',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#ad067f43e8dece00177a16214a561ddd1',1,'cv::Formatter']]], + ['set_5fargs_5f_263',['set_args_',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a247492daa0f3be7fe0265a1d19bb8597',1,'cv::ocl::Kernel::set_args_(int i, const _Tp0 &a0)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#ad756885d0824fd781064692a60697708',1,'cv::ocl::Kernel::set_args_(int i, const _Tp0 &a0, const _Tps &... rest_args)']]], + ['set_5fdifference_264',['set_difference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga35787a357982adc415c29c036f7aada7',1,'std::set_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga7cbebc70e1550ea9939c9269d7c7c289',1,'std::set_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga35787a357982adc415c29c036f7aada7',1,'set_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga7cbebc70e1550ea9939c9269d7c7c289',1,'set_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)(Global Namespace)']]], + ['set_5fdifference_5fminimal_5fn_265',['set_difference_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a5b63306dcd3a70e85dd42790b91aa0af',1,'__gnu_parallel::_Settings']]], + ['set_5fdistance_5ftype_266',['set_distance_type',['https://docs.opencv.org/4.2.0/dc/d8c/namespacecvflann.html#a9089240e70096e3b2ee3bec2b7f85c98',1,'cvflann']]], + ['set_5fgid_267',['set_gid',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145aea8f56585bae5bd29a5cb0d29767cccb',1,'set_gid(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145aea8f56585bae5bd29a5cb0d29767cccb',1,'set_gid(Global Namespace)']]], + ['set_5fintersection_268',['set_intersection',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#gad7a7b81513c68b856c0a2699c29532d0',1,'std::set_intersection(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga63b5280a2c5009456a51d38084ce1062',1,'std::set_intersection(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#gad7a7b81513c68b856c0a2699c29532d0',1,'set_intersection(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga63b5280a2c5009456a51d38084ce1062',1,'set_intersection(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)(Global Namespace)']]], + ['set_5fintersection_5fminimal_5fn_269',['set_intersection_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a397d3c431a2dc32de6e2eef4e7134b50',1,'__gnu_parallel::_Settings']]], + ['set_5fload_270',['set_load',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#acbe6814913bb7c30a34f4fc4d99d4e01',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger']]], + ['set_5floads_271',['set_loads',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11159.html#a5dba0dabb39ff7313a02f51b1bfefe24',1,'__gnu_pbds::hash_load_check_resize_trigger']]], + ['set_5fnew_5fhandler_272',['set_new_handler',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a08ab821429d6f9fd2f16f642de3e9163',1,'std']]], + ['set_5fnum_5fthreads_273',['set_num_threads',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::balanced_quicksort_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::balanced_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::default_parallel_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::exact_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::multiway_mergesort_exact_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::multiway_mergesort_sampling_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::multiway_mergesort_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::omp_loop_static_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::omp_loop_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::parallel_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::quicksort_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::sampling_tag::set_num_threads()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09707.html#ac4b2be3fbb957a3754b13167428ab6eb',1,'__gnu_parallel::unbalanced_tag::set_num_threads()']]], + ['set_5foperations_2eh_274',['set_operations.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00965.html',1,'']]], + ['set_5fsetpoint_275',['set_setpoint',['../classcontrol_1_1PlanarArmController.html#a1f7afb37e1c28f4c8fc15cc6d75ab4e0',1,'control::PlanarArmController']]], + ['set_5fsubtype_276',['set_subtype',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a63227e70c8b976fd6f65bb2d2d7dd021.html#a63227e70c8b976fd6f65bb2d2d7dd021',1,'nlohmann::byte_container_with_subtype']]], + ['set_5fsymmetric_5fdifference_277',['set_symmetric_difference',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga3b7e12cbdb1a0d4e7691e9730e1924c5',1,'std::set_symmetric_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#gabd18017e018c3090eacd4509e28cc432',1,'std::set_symmetric_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga3b7e12cbdb1a0d4e7691e9730e1924c5',1,'set_symmetric_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#gabd18017e018c3090eacd4509e28cc432',1,'set_symmetric_difference(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)(Global Namespace)']]], + ['set_5fsymmetric_5fdifference_5fminimal_5fn_278',['set_symmetric_difference_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#abf47bf2bbef9261d3d10b59558ddbdf2',1,'__gnu_parallel::_Settings']]], + ['set_5fterminate_279',['set_terminate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa53bcb9876c7b393a9e9e26fc90d5811',1,'std']]], + ['set_5fuid_280',['set_uid',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a2154ad8380cc7d3b920b3563078a50a8',1,'set_uid(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a2154ad8380cc7d3b920b3563078a50a8',1,'set_uid(Global Namespace)']]], + ['set_5funexpected_281',['set_unexpected',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a92329f10f9aba5eb5f26b11cf01d5166',1,'std']]], + ['set_5funion_282',['set_union',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga45c2e77ca73dabf6b1ccabbecf0291a6',1,'std::set_union(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga3d54d31bc70a0ff4596f5171ec728906',1,'std::set_union(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga45c2e77ca73dabf6b1ccabbecf0291a6',1,'set_union(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html#ga3d54d31bc70a0ff4596f5171ec728906',1,'set_union(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)(Global Namespace)']]], + ['set_5funion_5fminimal_5fn_283',['set_union_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ab42faf337cfe7b64edfb7e61c6dadd08',1,'__gnu_parallel::_Settings']]], + ['set_5fx_5fvel_284',['set_x_vel',['../classcontrol_1_1PlanarArmController.html#a0d8b187d476a4140d5f1508c5ed7f50d',1,'control::PlanarArmController']]], + ['set_5fy_5fvel_285',['set_y_vel',['../classcontrol_1_1PlanarArmController.html#a55a1443d50e3e03bc99ceab615e3ca36',1,'control::PlanarArmController']]], + ['setactivation_286',['setActivation',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a43dab9b2aae0d48ae01cb70112009ee1',1,'cv::dnn::Layer']]], + ['setactivationfunction_287',['setActivationFunction',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a16998f97db903c1c652e68f342240524',1,'cv::ml::ANN_MLP']]], + ['setactivevarcount_288',['setActiveVarCount',['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html#a54beb36a90fbc804d5337a8b74933d09',1,'cv::ml::RTrees']]], + ['setadjustoutliers_289',['setAdjustOutliers',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a6eeadb4ea09e54a4252c8a81057a7431',1,'cv::ximgproc::AdaptiveManifoldFilter']]], + ['setagregationwindowsize_290',['setAgregationWindowSize',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a3056bdb39b0ae805f4c3922671af19d1',1,'cv::stereo::StereoBinaryBM']]], + ['setalgorithmtype_291',['setAlgorithmType',['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#aaa7548bc92dd0b43bb96e3c230e1997e',1,'cv::ml::KNearest']]], + ['setalpha_292',['setAlpha',['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html#a95a3951e82f853e3cfbd9edb8b8bc148',1,'cv::superres::BroxOpticalFlow::setAlpha()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a16d7f5ade6b0fce4d83cc27380755cc0',1,'cv::ximgproc::EdgeBoxes::setAlpha()'],['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a1ca264fc585dd4e6bb8f96235cb01fe4',1,'cv::ximgproc::RICInterpolator::setAlpha()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a89174e84691f8f7dfcf3511ee57de069',1,'cv::superres::SuperResolution::setAlpha()'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#a91929c3edede9f22fefc58c24ab863ba',1,'cv::VariationalRefinement::setAlpha()']]], + ['setangleepsilon_293',['setAngleEpsilon',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a6d0446ac2470a7c3c7656ace92a7b656',1,'cv::GeneralizedHoughGuil']]], + ['setanglestep_294',['setAngleStep',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a889384a9360ec2b7efdc0ff8fbbb4bf9',1,'cv::GeneralizedHoughGuil']]], + ['setanglethresh_295',['setAngleThresh',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a8411f94d623c66c6c53872a0f9c5416f',1,'cv::GeneralizedHoughGuil']]], + ['setanglethreshold_296',['setAngleThreshold',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#afdabf172865125c2c67a6de7f4c13e6d',1,'cv::rgbd::FastICPOdometry']]], + ['setangularbins_297',['setAngularBins',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#aade984ec5eca56b0a7f5b8681d681c61',1,'cv::ShapeContextDistanceExtractor']]], + ['setannealcoolingratio_298',['setAnnealCoolingRatio',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a5c1b54d05fc3ac1b167752ed452c0a5e',1,'cv::ml::ANN_MLP']]], + ['setannealenergyrng_299',['setAnnealEnergyRNG',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a6d7a3a6206a52f1d80268920361ae1b8',1,'cv::ml::ANN_MLP']]], + ['setannealfinalt_300',['setAnnealFinalT',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#aa6a0eeeb1725bed54b00882bf535715d',1,'cv::ml::ANN_MLP']]], + ['setannealinitialt_301',['setAnnealInitialT',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a4fda01324f3eb715f4c289adb386d875',1,'cv::ml::ANN_MLP']]], + ['setannealiteperstep_302',['setAnnealItePerStep',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a4ec199a72ea3cf8ea6b35a78afb86414',1,'cv::ml::ANN_MLP']]], + ['setapperturesize_303',['setAppertureSize',['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html#aac7d0602338e1a2a783811a929967714',1,'cv::cuda::CannyEdgeDetector']]], + ['setargs_304',['setArgs',['https://docs.opencv.org/4.2.0/dc/d02/classcv_1_1GCall.html#a59d99a6b69540532068360be493a90dc',1,'cv::GCall']]], + ['setautorelease_305',['setAutoRelease',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a45854282c3f6dc58a12b82cd53e50845',1,'cv::ogl::Arrays::setAutoRelease()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#aff9abd9111dfb14686a788eaaa94770a',1,'cv::ogl::Buffer::setAutoRelease()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#ace1fa264dc4a294bc26d2d074217cb4d',1,'cv::ogl::Texture2D::setAutoRelease()']]], + ['setbackground_306',['setBackground',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a176e1f18085d62b2b7b4a52e770e0b0b',1,'cv::ovis::WindowScene::setBackground(InputArray image)=0'],['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a941fccfb93b57de5923d6682fb2c8620',1,'cv::ovis::WindowScene::setBackground(const Scalar &color)=0']]], + ['setbackgroundcolor_307',['setBackgroundColor',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a8c0828b0ce2725aefaf3f89208e5f29f',1,'cv::viz::Viz3d']]], + ['setbackgroundmeshlab_308',['setBackgroundMeshLab',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a634ce6d63c1a9fb159d974aef58d953d',1,'cv::viz::Viz3d']]], + ['setbackgroundprior_309',['setBackgroundPrior',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a6298864b9feda4e5a85af7832b86038a',1,'cv::bgsegm::BackgroundSubtractorGMG::setBackgroundPrior()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#ab9eae4ff83156c056e75a2f01aebee62',1,'cv::cuda::BackgroundSubtractorGMG::setBackgroundPrior()']]], + ['setbackgroundratio_310',['setBackgroundRatio',['https://docs.opencv.org/4.2.0/d6/da7/classcv_1_1bgsegm_1_1BackgroundSubtractorMOG.html#afe4225db2b061ad86ea81245ef0197d6',1,'cv::bgsegm::BackgroundSubtractorMOG::setBackgroundRatio()'],['https://docs.opencv.org/4.2.0/d1/dfe/classcv_1_1cuda_1_1BackgroundSubtractorMOG.html#a16e03168604c382d4a3f4b5cff246ced',1,'cv::cuda::BackgroundSubtractorMOG::setBackgroundRatio()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#ab8bdfc9c318650aed53ecc836667b56a',1,'cv::BackgroundSubtractorMOG2::setBackgroundRatio()']]], + ['setbackgroundtexture_311',['setBackgroundTexture',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#afbc1293b9acd3fd932ca3f1ff649f065',1,'cv::viz::Viz3d']]], + ['setbackpropmomentumscale_312',['setBackpropMomentumScale',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a59fd3f49aba9418a96d44998deb68d00',1,'cv::ml::ANN_MLP']]], + ['setbackpropweightscale_313',['setBackpropWeightScale',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a80a03e3e259441438f7ae3312104161f',1,'cv::ml::ANN_MLP']]], + ['setbase_314',['setBase',['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#ac7baaf45599b3293408c0ebc394a5c35',1,'cv::saliency::ObjectnessBING']]], + ['setbase_315',['setbase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af57577148b39749ea52311d68d8a17b4',1,'std']]], + ['setbaseimage_316',['setBaseImage',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a4589ed0c65f2f02a049d603fac140f81',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], + ['setbbresdir_317',['setBBResDir',['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#aacd56c302c06a8182ee77598fc5128de',1,'cv::saliency::ObjectnessBING']]], + ['setbendingenergyweight_318',['setBendingEnergyWeight',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a576d05fc6eedd2353d5e03257d807808',1,'cv::ShapeContextDistanceExtractor']]], + ['setbeta_319',['setBeta',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#aa507a96446cf40c246ea6ad58adeb81e',1,'cv::ximgproc::EdgeBoxes']]], + ['setbias_320',['setBias',['https://docs.opencv.org/4.2.0/da/d53/classcv_1_1TonemapDrago.html#ae2efd6e5273ac86ed76a2ca89939aaba',1,'cv::TonemapDrago']]], + ['setbinarykerneltype_321',['setBinaryKernelType',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a5c56c7e2c65c4e1656cab06c3e8ddda5',1,'cv::stereo::StereoBinaryBM::setBinaryKernelType()'],['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#aba6accc59d827028635117452a8e5df0',1,'cv::stereo::StereoBinarySGBM::setBinaryKernelType()']]], + ['setblackthreshold_322',['setBlackThreshold',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1structured__light_1_1GrayCodePattern.html#a3607cba801a696881df31bbd6c59c4fd',1,'cv::structured_light::GrayCodePattern']]], + ['setblender_323',['setBlender',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a79651cf9e4b87cb6af26caa0535b9baa',1,'cv::Stitcher']]], + ['setblocksize_324',['setBlockSize',['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a2100042d80ccf54b18d6513afff5a731',1,'cv::detail::BlocksCompensator::setBlockSize(int width, int height)'],['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a974bb46e14126304ceb3cee8ae34207f',1,'cv::detail::BlocksCompensator::setBlockSize(Size size)'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#ac44ba3d060603efa0af8da079f5fedb3',1,'cv::GFTTDetector::setBlockSize()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a5c17f52f01b7a289dbcb8912f1b89889',1,'cv::rgbd::RgbdPlane::setBlockSize()'],['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#a38814e8a33d59f4eb5db33de04fe8c34',1,'cv::StereoMatcher::setBlockSize()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#a494867781b98f903b4ca23c5e96e2f15',1,'cv::stereo::StereoMatcher::setBlockSize()']]], + ['setblurfordescriptor_325',['setBlurForDescriptor',['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#a6f1ff360e8700d57446d017fd4a0539e',1,'cv::cuda::ORB']]], + ['setblurkernelsize_326',['setBlurKernelSize',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#af5ee27c5ceda96493d76657384e18fe0',1,'cv::superres::SuperResolution']]], + ['setblurrinessrates_327',['setBlurrinessRates',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a79a9a2c76a22405a727fbb2b9c22bf22',1,'cv::videostab::DeblurerBase']]], + ['setblursigma_328',['setBlurSigma',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a082bfe061356d8d4f82ee1aa0578e86c',1,'cv::superres::SuperResolution']]], + ['setboosttype_329',['setBoostType',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a3506f61268d7845b1114c0d75f51b724',1,'cv::ml::Boost']]], + ['setbordermode_330',['setBorderMode',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#aaacb52b91f791b467b0e3f69a7ad80f5',1,'cv::videostab::MotionInpainter::setBorderMode()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a5c2b79352223792a044080dfd365b30b',1,'cv::videostab::StabilizerBase::setBorderMode()']]], + ['setbreakonerror_331',['setBreakOnError',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae4904ef072dede53cf161d9a6869083f',1,'cv::setBreakOnError()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae4904ef072dede53cf161d9a6869083f',1,'setBreakOnError()(Global Namespace)']]], + ['setbuf_332',['setbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#afdc468aedafb80e43f14569d09485e6b',1,'__gnu_cxx::enc_filebuf::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#afdc468aedafb80e43f14569d09485e6b',1,'__gnu_cxx::stdio_filebuf::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#aad2e731291673229100bde1f24ce828f',1,'__gnu_cxx::stdio_sync_filebuf::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#afdc468aedafb80e43f14569d09485e6b',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#afdc468aedafb80e43f14569d09485e6b',1,'basic_filebuf< char_type, traits_type >::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#aad2e731291673229100bde1f24ce828f',1,'basic_streambuf< _Elem, _Tr >::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#aad2e731291673229100bde1f24ce828f',1,'basic_streambuf< char, _Traits >::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#aad2e731291673229100bde1f24ce828f',1,'basic_streambuf< char, char_traits< char > >::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#afdc468aedafb80e43f14569d09485e6b',1,'std::basic_filebuf::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#aad2e731291673229100bde1f24ce828f',1,'std::basic_streambuf::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a3ecbb2133b5c6b598b0344b7cbbe1757',1,'std::basic_stringbuf::setbuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#aad2e731291673229100bde1f24ce828f',1,'std::wbuffer_convert::setbuf()']]], + ['setbufferpoolconfig_333',['setBufferPoolConfig',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga93da1d4c64558590950409266b1e2a92',1,'cv::cuda::setBufferPoolConfig()'],['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga93da1d4c64558590950409266b1e2a92',1,'setBufferPoolConfig()(Global Namespace)']]], + ['setbufferpoolusage_334',['setBufferPoolUsage',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga7dbf253e43493eb870c9759cc35bbffb',1,'cv::cuda::setBufferPoolUsage()'],['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga7dbf253e43493eb870c9759cc35bbffb',1,'setBufferPoolUsage()(Global Namespace)']]], + ['setbundleadjuster_335',['setBundleAdjuster',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#aa3060cbd7d492a53052754439e830d40',1,'cv::Stitcher']]], + ['setc_336',['setC',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#af9f543ef011db0ded375bb6f68984142',1,'cv::ml::SVM']]], + ['setcalculatevarimportance_337',['setCalculateVarImportance',['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html#a9f034bb1cb935f54a66b8b711daa5ee0',1,'cv::ml::RTrees']]], + ['setcallback_338',['setCallback',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a6fab6401190231590ce607cfd6a53ba9',1,'cv::text::ERFilter']]], + ['setcamera_339',['setCamera',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a3ccaad72a408090922c3bf1061586ec0',1,'cv::viz::Viz3d']]], + ['setcameraintrinsicoptions_340',['setCameraIntrinsicOptions',['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html#aed6306f62d1bfc9a82ba8d6a47e911f5',1,'cv::sfm::BaseSFM::setCameraIntrinsicOptions()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#a54603b3cafcf57ab89effbd4f479c389',1,'cv::sfm::SFMLibmvEuclideanReconstruction::setCameraIntrinsicOptions()']]], + ['setcameraintrinsics_341',['setCameraIntrinsics',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a1dec8cc3123d4d37e5ab436ab6d2e62a',1,'cv::ovis::WindowScene']]], + ['setcameralookat_342',['setCameraLookAt',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a20cda38dfceeedbf62a67a2eb649f125',1,'cv::ovis::WindowScene']]], + ['setcameramatrix_343',['setCameraMatrix',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#ac77a0fe8d5d7bcd3e8d76f7626d2031a',1,'cv::rgbd::FastICPOdometry::setCameraMatrix()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#aa9e4e89e20f76445afb86127acb2fa8d',1,'cv::rgbd::ICPOdometry::setCameraMatrix()'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a658b4fd102a96211fba428b16633b1c8',1,'cv::rgbd::Odometry::setCameraMatrix()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a79e641eac7076266bbf8b602b19e136c',1,'cv::rgbd::RgbdICPOdometry::setCameraMatrix()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#aace77bf9b7c997cf34480db6660c186d',1,'cv::rgbd::RgbdOdometry::setCameraMatrix()']]], + ['setcameraparams_344',['setCameraParams',['https://docs.opencv.org/4.2.0/dc/d2c/structcv_1_1detail_1_1ProjectorBase.html#a8b90f9babaf26ca042a1cd872ded4da2',1,'cv::detail::ProjectorBase']]], + ['setcamerapose_345',['setCameraPose',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a798824edcea2af5e68bbb9feb65aa8bc',1,'cv::ovis::WindowScene']]], + ['setcannyhighthresh_346',['setCannyHighThresh',['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a0652a8600e2cc030a7d87be2d79ce5b1',1,'cv::GeneralizedHough']]], + ['setcannylowthresh_347',['setCannyLowThresh',['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a8206707627bc2b5b09b37da06f6580a6',1,'cv::GeneralizedHough']]], + ['setcannythreshold_348',['setCannyThreshold',['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#a4dbc24683ff04e2dbc791fd80d6a1076',1,'cv::cuda::HoughCirclesDetector']]], + ['setcellsize_349',['setCellSize',['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a88c504fb2b84717b57f6bb897a05b480',1,'cv::videostab::TranslationBasedLocalOutlierRejector']]], + ['setclassweights_350',['setClassWeights',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a9cb80c3df6c2626b9836eaa0e0c58bf0',1,'cv::ml::SVM']]], + ['setclip_351',['setClip',['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#a97199300e121417122739c0548fb54e7',1,'cv::viz::Camera']]], + ['setcliplimit_352',['setClipLimit',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1CLAHE.html#abc15ca6784ab92c0d93e8b013fac191f',1,'cv::CLAHE']]], + ['setclusterminmag_353',['setClusterMinMag',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#ac3b6fcdce4f94eb8f63c3bd94977f340',1,'cv::ximgproc::EdgeBoxes']]], + ['setclusterminsize_354',['setClusterMinSize',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a9b1788e47f815b0bdba559062e1be914',1,'cv::xfeatures2d::PCTSignatures']]], + ['setclustersnumber_355',['setClustersNumber',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a069ee46c360ed183d5eb96b8b8261d8a',1,'cv::ml::EM']]], + ['setcmdvel_356',['setCmdVel',['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html#a52eb0845b28f3e387f244b1d0ff906df',1,'net::mc::tasks::PowerRepeatTask::setCmdVel()'],['../namespacerobot.html#a8363ee6c4c4bd4b93c4188984dc77ad6',1,'robot::setCmdVel()']]], + ['setcoef0_357',['setCoef0',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#af0cd3684aabfacbd6749d8649d5971ed',1,'cv::ml::SVM']]], + ['setcolor_358',['setColor',['https://docs.opencv.org/4.2.0/d3/d49/classcv_1_1viz_1_1Widget2D.html#a75b6f7d02e74feb8e032cb0451c8d712',1,'cv::viz::Widget2D::setColor()'],['https://docs.opencv.org/4.2.0/d9/d26/classcv_1_1viz_1_1Widget3D.html#ab467fdefb482d6a0da42528ab98738a1',1,'cv::viz::Widget3D::setColor()']]], + ['setcoloradaptation_359',['setColorAdaptation',['https://docs.opencv.org/4.2.0/d0/dec/classcv_1_1TonemapReinhard.html#ad9c85bea5573d6384a716c05d4e681fd',1,'cv::TonemapReinhard']]], + ['setcolorarray_360',['setColorArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#ad1ac4dcf3a6a09e0e1c30f6da1bc87ad',1,'cv::ogl::Arrays']]], + ['setcolorsaturation_361',['setColorSaturation',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#aa66dca22cadf9293164bef39f3690a94',1,'cv::bioinspired::Retina']]], + ['setcols_362',['setCols',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#abb66d5573dd304273b35a9e150a946e3',1,'cv::rgbd::RgbdNormals']]], + ['setcomplexityreductionthreshold_363',['setComplexityReductionThreshold',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#af45a64f718ef1b43ca8f738c496408f1',1,'cv::BackgroundSubtractorMOG2']]], + ['setcompositingresol_364',['setCompositingResol',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#afe927e80fcb2ca2061630ddd98eebba8',1,'cv::Stitcher']]], + ['setcompositors_365',['setCompositors',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#aaae12c1ffbdaeb8bbd1e8c75512379c3',1,'cv::ovis::WindowScene']]], + ['setconfidence_366',['setConfidence',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a59629ac1b318ace9e4fb34ec9379d22e',1,'cv::stereo::Matching']]], + ['setconfthresh_367',['setConfThresh',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#aa5e180dd73dc7ce4fa1627fda01b1bfc',1,'cv::detail::BundleAdjusterBase']]], + ['setconstant_368',['setConstant',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac2f1e50d1f567da38da1d2f07c5ab559',1,'Eigen::DenseBase::setConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac2f1e50d1f567da38da1d2f07c5ab559',1,'DenseBase< ArrayWrapper< ExpressionType > >::setConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac2f1e50d1f567da38da1d2f07c5ab559',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::setConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac2f1e50d1f567da38da1d2f07c5ab559',1,'DenseBase< Solve< Decomposition, RhsType > >::setConstant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'Eigen::PlainObjectBase::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'Eigen::PlainObjectBase::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'Eigen::PlainObjectBase::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'Eigen::PlainObjectBase::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aac6bc5261783ec3008a51c2654de73e8',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index size, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af9996d6a98f45e84a908dc9851c8332e',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a56e04c9e00a84eeb26774842f4a0f6fd',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(NoChange_t, Index cols, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae521bf911dfa2823c8056dc9c1776bcd',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setConstant(Index rows, NoChange_t, const Scalar &val)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a02574e5085e789ff9840d2b708e0126f',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::setConstant()']]], + ['setconstructfcn_369',['setConstructFcn',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#a23c09862e5cc752a9ee6feea85735a9a',1,'cv::detail::GArrayU']]], + ['setcontrast_370',['setContrast',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga99eaaa24dc25ba387093e957bfca1cad',1,'cv::xphoto::TonemapDurand::setContrast()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga99eaaa24dc25ba387093e957bfca1cad',1,'setContrast()(Global Namespace)']]], + ['setcontrastweight_371',['setContrastWeight',['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html#af75eb4cbbc759e8ce7ba9514703fba4b',1,'cv::MergeMertens']]], + ['setcorrectionforinclusion_372',['setCorrectionForInclusion',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ada19bffb5b015f14af92e7c472989605',1,'cv::videostab::StabilizerBase']]], + ['setcostextractor_373',['setCostExtractor',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a1d3a0258c206f4be2d3c518f1087f425',1,'cv::ShapeContextDistanceExtractor']]], + ['setcostfunction_374',['setCostFunction',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a03aed0908c6b514c37ed3f00c0b057dd',1,'cv::detail::DpSeamFinder::setCostFunction(CostFunction val)'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#aa4fd3c779d56b18d2ba806558957c04a',1,'cv::detail::DpSeamFinder::setCostFunction(String val)']]], + ['setcostmap_375',['setCostMap',['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#aa0367be883adbf08cb8036c8fbae35fa',1,'cv::ximgproc::EdgeAwareInterpolator::setCostMap()'],['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a2893aa23abdafec8c5efd45773a83ba4',1,'cv::ximgproc::RICInterpolator::setCostMap()']]], + ['setcovariancematrixtype_376',['setCovarianceMatrixType',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a8b383c62697eac9a972931674790f6cd',1,'cv::ml::EM']]], + ['setcrosssegmentationthreshold_377',['setCrossSegmentationThreshold',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a768354f41902b51e43956d8f46802c77',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['setctrsize_378',['setCtrSize',['https://docs.opencv.org/4.2.0/d5/d72/classcv_1_1ximgproc_1_1ContourFitting.html#a24bfff7e1fe21efb3e5af97e132fdfd6',1,'cv::ximgproc::ContourFitting']]], + ['setcurrentconfidencemap_379',['setCurrentConfidenceMap',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a8fb853d6fc31fdbb1f9b6ac97c3210c9',1,'cv::TrackerStateEstimatorAdaBoosting::setCurrentConfidenceMap()'],['https://docs.opencv.org/4.2.0/d9/d20/classcv_1_1TrackerStateEstimatorMILBoosting.html#a543b3e1409b9493297bfbabcf3f94dc8',1,'cv::TrackerStateEstimatorMILBoosting::setCurrentConfidenceMap()']]], + ['setcustomkernel_380',['setCustomKernel',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a16a3ddfd7bad030268f024f5a6c561f1',1,'cv::ml::SVM']]], + ['setcut_381',['setCut',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a7558c6509092d713c29ac92cffcc1355',1,'cv::AlignMTB']]], + ['setcvfolds_382',['setCVFolds',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a082ed33b1dd2101152dd33bdc2847404',1,'cv::ml::DTrees']]], + ['setdataweight_383',['setDataWeight',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#abbc588e1bbd3713e4520af5e349fd648',1,'cv::cuda::StereoBeliefPropagation']]], + ['setdeblurer_384',['setDeblurer',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a45319b46a3729c36cda4f664da2a69b1',1,'cv::videostab::StabilizerBase']]], + ['setdebugflag_385',['setDebugFlag',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga00c72e5ec4298bad4394ce601affe294',1,'cvv']]], + ['setdecisionthreshold_386',['setDecisionThreshold',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a76fcbe31b69127db9679f4dd7769de5a',1,'cv::bgsegm::BackgroundSubtractorGMG::setDecisionThreshold()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a66aa29ab364fd739986b238b218ed5af',1,'cv::cuda::BackgroundSubtractorGMG::setDecisionThreshold()']]], + ['setdefaultallocator_387',['setDefaultAllocator',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a5cc463cf6516957a2d78bd03c6d81de5',1,'cv::cuda::GpuMat::setDefaultAllocator()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a536a771cbad0b8360091e0315ebfc524',1,'cv::Mat::setDefaultAllocator()']]], + ['setdefaultcost_388',['setDefaultCost',['https://docs.opencv.org/4.2.0/df/d9a/classcv_1_1HistogramCostExtractor.html#aea35e7379f43e4c1b09ae5cfbce41547',1,'cv::HistogramCostExtractor']]], + ['setdefaultk_389',['setDefaultK',['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#a0e4bbe73142a27fda05f73125b1ed5ef',1,'cv::ml::KNearest']]], + ['setdefaultlearningrate_390',['setDefaultLearningRate',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#ae56c2448a3fdfe4ba00777a43730dbb9',1,'cv::bgsegm::BackgroundSubtractorGMG::setDefaultLearningRate()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#ac462bb405ba371e78c36af46b6e0e4c7',1,'cv::cuda::BackgroundSubtractorGMG::setDefaultLearningRate()']]], + ['setdegree_391',['setDegree',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a756297055239fa33536c09b0f5721494',1,'cv::ml::SVM']]], + ['setdelta_392',['setDelta',['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#a9828f6a0cc9b0aebf87db9ee34c8b2f7',1,'cv::MSER::setDelta()'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#a8622fbe02661bf7e38f28956f38a086b',1,'cv::VariationalRefinement::setDelta()']]], + ['setdepth_393',['setDepth',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a3a95549cdfc2d0b57573cdc64f064fab',1,'cv::rgbd::DepthCleaner::setDepth()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a5cc4d09c16df66b4de115b5ed557b46b',1,'cv::rgbd::RgbdNormals::setDepth()']]], + ['setdepthdiscontinuityradius_394',['setDepthDiscontinuityRadius',['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1ximgproc_1_1DisparityWLSFilter.html#af813957e9c5526df8dbf23e7012dd26d',1,'cv::ximgproc::DisparityWLSFilter']]], + ['setdescription_395',['setDescription',['../classcam_1_1Camera.html#a59dedb4d0b920e2a141e02b7d6b05a36',1,'cam::Camera']]], + ['setdescriptorchannels_396',['setDescriptorChannels',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#ac08316db91d007c7c0899efb0f222605',1,'cv::AKAZE']]], + ['setdescriptorextractor_397',['setDescriptorExtractor',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a6a3f98641555cf96c5f7abd8e5433346',1,'cv::ccalib::CustomPattern']]], + ['setdescriptorfast_398',['setDescriptorFast',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#af67c8ec077bd1593054f9d63280c6627',1,'cv::tbm::ITrackerByMatching']]], + ['setdescriptorformat_399',['setDescriptorFormat',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a6e3e1075a567268f2dfb2151b1c99cb6',1,'cv::cuda::HOG']]], + ['setdescriptormatcher_400',['setDescriptorMatcher',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a18a96fa9cde8fcbb52ad28c649d9cec6',1,'cv::ccalib::CustomPattern']]], + ['setdescriptorsize_401',['setDescriptorSize',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a3629d114449e442954fb26fb245422f1',1,'cv::AKAZE']]], + ['setdescriptorstrong_402',['setDescriptorStrong',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#aa0210aeffbb16ba50975999dbccc34db',1,'cv::tbm::ITrackerByMatching']]], + ['setdescriptortype_403',['setDescriptorType',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a845d6c10f25b3c0abe1b40aa6b4f83fb',1,'cv::AKAZE']]], + ['setdetector_404',['setDetector',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a629366ab4e0e482425c244f66a121337',1,'cv::videostab::KeypointBasedMotionEstimator']]], + ['setdetectshadows_405',['setDetectShadows',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#a7bc545ab1db20d1522b429cacbf4917d',1,'cv::BackgroundSubtractorKNN::setDetectShadows()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a329fea969ebfb55814f85418b63c4d96',1,'cv::BackgroundSubtractorMOG2::setDetectShadows()']]], + ['setdevice_406',['setDevice',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gaefa34186b185de47851836dba537828b',1,'cv::cuda::setDevice()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gaefa34186b185de47851836dba537828b',1,'setDevice()(Global Namespace)']]], + ['setdeviceid_407',['setDeviceId',['https://docs.opencv.org/4.2.0/d7/d8d/classcv_1_1cnn__3dobj_1_1descriptorExtractor.html#a2d2ae7ec2cc9aba124c710de765f0d07',1,'cv::cnn_3dobj::descriptorExtractor']]], + ['setdevicetype_408',['setDeviceType',['https://docs.opencv.org/4.2.0/d7/d8d/classcv_1_1cnn__3dobj_1_1descriptorExtractor.html#a373a97505c37993ab912130d2b620e96',1,'cv::cnn_3dobj::descriptorExtractor']]], + ['setdiffusivity_409',['setDiffusivity',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#ac216bff9fc19f9506373ed9251ca3b77',1,'cv::AKAZE::setDiffusivity()'],['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a636da9c984f4f5b1d7c7423b39d8a012',1,'cv::KAZE::setDiffusivity()']]], + ['setdiscsinglejump_410',['setDiscSingleJump',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#ae26d0eca3406ae9449054de5531a4abd',1,'cv::cuda::StereoBeliefPropagation']]], + ['setdisp12maxdiff_411',['setDisp12MaxDiff',['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#aede8620506ff7f27d106fff25777514d',1,'cv::StereoMatcher::setDisp12MaxDiff()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#a09a0171a2ebbc5678c17e26981e53f0d',1,'cv::stereo::StereoMatcher::setDisp12MaxDiff()']]], + ['setdist2threshold_412',['setDist2Threshold',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#aae40ce724aa313259609606853b6956f',1,'cv::BackgroundSubtractorKNN']]], + ['setdistancefast_413',['setDistanceFast',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a4643ca0a52399b93f28d19323d4d4583',1,'cv::tbm::ITrackerByMatching']]], + ['setdistanceflag_414',['setDistanceFlag',['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1HausdorffDistanceExtractor.html#a4469fbc8322ee88d34b4dc885e173ec6',1,'cv::HausdorffDistanceExtractor']]], + ['setdistancefunction_415',['setDistanceFunction',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a828b6802c9960647a128b966f7a79045',1,'cv::xfeatures2d::PCTSignatures']]], + ['setdistancestrong_416',['setDistanceStrong',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#aa2364e3e085dcd0c488cc6940193885c',1,'cv::tbm::ITrackerByMatching']]], + ['setdistthreshold_417',['setDistThreshold',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#acec803125f370bd1708fdf72b560f656',1,'cv::videostab::MotionInpainter']]], + ['setdosort_418',['setDoSort',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#af5b67e1d6259cba8c347b39e8641efa9',1,'cv::cuda::HoughLinesDetector']]], + ['setdp_419',['setDp',['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a82fa95feb453d5cb517e55ca20b199e4',1,'cv::GeneralizedHough::setDp()'],['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#af477bd20671090c1c74bbc32e87f1ebf',1,'cv::cuda::HoughCirclesDetector::setDp()']]], + ['setdropthreshold_420',['setDropThreshold',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a48a8b9dcd84024b8cbdcd6d9eae220b7',1,'cv::xfeatures2d::PCTSignatures']]], + ['setdroptol_421',['setDroptol',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteLUT.html#a9628c5a595e9e984c72d1f8e671a6925',1,'Eigen::IncompleteLUT']]], + ['setedgemergethr_422',['setEdgeMergeThr',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a8d8dbca2ea4b46d4dcf86d343133a887',1,'cv::ximgproc::EdgeBoxes']]], + ['setedgeminmag_423',['setEdgeMinMag',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a5d77b36ebe5918fdd2187055398bb07d',1,'cv::ximgproc::EdgeBoxes']]], + ['setedgepoints_424',['setEdgePoints',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#adc6ca8745fd0d7a28a38c31deb0b1342',1,'cv::Subdiv2D']]], + ['setedgethreshold_425',['setEdgeThreshold',['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#aa4d68e6dc2b69dfa023d1c37f3a26d83',1,'cv::cuda::DisparityBilateralFilter::setEdgeThreshold()'],['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a0a8924532c4c76c74899fe541678cfd1',1,'cv::ORB::setEdgeThreshold()']]], + ['setemax_426',['setEmax',['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#a6b5975897bfc53ebc35b88414512f6f0',1,'cv::ml::KNearest']]], + ['setempty_427',['setEmpty',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a16bc3e6779107a091f08e4cb7e36e793',1,'Eigen::AlignedBox']]], + ['setentitylookat_428',['setEntityLookAt',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a96d28d1cfb421d70b396a26087139f8b',1,'cv::ovis::WindowScene']]], + ['setentitypose_429',['setEntityPose',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#abc5d20d153b972827eea8ab831e06fd6',1,'cv::ovis::WindowScene']]], + ['setentityproperty_430',['setEntityProperty',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a784df6d58dffe66a2d3d84f94f3cc44f',1,'cv::ovis::WindowScene::setEntityProperty(const String &name, int prop, const Scalar &value)=0'],['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#ae88505afc2349dbe4156acb42c7e94ea',1,'cv::ovis::WindowScene::setEntityProperty(const String &name, int prop, const String &value)=0']]], + ['setepick_431',['setEPICK',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#ada4f31769858114fc948024c61b18a75',1,'cv::optflow::DenseRLOFOpticalFlow']]], + ['setepiclambda_432',['setEPICLambda',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a3212d9248b833b155dda737b17b389a8',1,'cv::optflow::DenseRLOFOpticalFlow']]], + ['setepicsigma_433',['setEPICSigma',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a7cde3a02095187974a61729a049f02ea',1,'cv::optflow::DenseRLOFOpticalFlow']]], + ['setepsilon_434',['setEpsilon',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a0bd444460924f21db113dd278cfe70e6',1,'cv::optflow::DualTVL1OpticalFlow::setEpsilon()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#abdcf95d17ff645f978be66aa1ddcc4b3',1,'cv::superres::DualTVL1OpticalFlow::setEpsilon()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#ae58efcc59c522c98f218a69b1fc2414d',1,'cv::cuda::OpticalFlowDual_TVL1::setEpsilon()']]], + ['setepsx_435',['setEpsX',['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a1a2d277d1fd2bc466aa2a7bb0458dd51',1,'cv::QRCodeDetector']]], + ['setepsy_436',['setEpsY',['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a31a93aaed30ce03fee7ddbe16d9fd800',1,'cv::QRCodeDetector']]], + ['setestimatetrimratio_437',['setEstimateTrimRatio',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a9c5f4df50af8214defda588f3c6be4d7',1,'cv::videostab::TwoPassStabilizer']]], + ['setestimator_438',['setEstimator',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a29fecbbacdfd0adc964f8ce451c0046b',1,'cv::Stitcher']]], + ['seteta_439',['setEta',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#aa52186543a9f4436baecb20b07a7d774',1,'cv::ximgproc::EdgeBoxes']]], + ['setexception_440',['setException',['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#a0d730091355100fb0300c9b6533034d6',1,'cv::AsyncPromise']]], + ['setexceptionmode_441',['setExceptionMode',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#afcab97adfa090883dce5523e9ebcb995',1,'cv::VideoCapture']]], + ['setexcluderange_442',['setExcludeRange',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#aeed184da3483a94c8a25351555d41b6a',1,'cv::AlignMTB']]], + ['setexp_443',['setExp',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga22d81509e98aefb71a1966cb2f5901d9',1,'cv::softdouble::setExp()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3701dfb1bc90fcb6de674e4d7f73cd98',1,'cv::softfloat::setExp()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3701dfb1bc90fcb6de674e4d7f73cd98',1,'setExp()(Global Namespace)']]], + ['setexposurecompensator_444',['setExposureCompensator',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a487373f15a54192e6a85ce6b04151d91',1,'cv::Stitcher']]], + ['setexposureweight_445',['setExposureWeight',['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html#a00d81f2a0a6c0f3abd2fd21ad57f58c9',1,'cv::MergeMertens']]], + ['setextended_446',['setExtended',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#ab32e09a09bc9d5475601e309bbb04f02',1,'cv::KAZE::setExtended()'],['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html#a2809dee4e7cc6979b5d1e7523f73c075',1,'cv::xfeatures2d::SURF::setExtended()']]], + ['setf_447',['setf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'basic_ios< char, _Traits >::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'basic_ios< char, _Traits >::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'basic_iostream< char >::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'basic_iostream< char >::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'basic_istream< char >::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'basic_istream< char >::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'basic_istream< char, _Traits >::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'basic_istream< char, _Traits >::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'basic_ostream< char >::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'basic_ostream< char >::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'basic_ostream< char, _Traits >::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'basic_ostream< char, _Traits >::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_fstream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_fstream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_ifstream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_ifstream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_ios::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_ios::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_iostream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_iostream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_istream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_istream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_istringstream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_istringstream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_ofstream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_ofstream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_ostream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_ostream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_ostringstream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_ostringstream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::basic_stringstream::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::basic_stringstream::setf(fmtflags __fmtfl, fmtflags __mask)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a007b2f6648ba857d6ae3e68f936ca10a',1,'std::ios_base::setf(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a87fd48e3d7a0515d3958eb9d9fbba45d',1,'std::ios_base::setf(fmtflags __fmtfl, fmtflags __mask)']]], + ['setfacedetector_448',['setFaceDetector',['https://docs.opencv.org/4.2.0/dc/de0/classcv_1_1face_1_1FacemarkKazemi.html#a8bed56231214aad70b91a5573b2a8aa6',1,'cv::face::FacemarkKazemi::setFaceDetector()'],['https://docs.opencv.org/4.2.0/d3/d81/classcv_1_1face_1_1FacemarkTrain.html#a39ba4218820e388732655c2916034ea3',1,'cv::face::FacemarkTrain::setFaceDetector()']]], + ['setfastpyramids_449',['setFastPyramids',['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#ad1e4f8b3a53098f5994a2048bd84ef92',1,'cv::FarnebackOpticalFlow::setFastPyramids()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#a07ad12f9f47f8fcf5a90c9a39377d440',1,'cv::cuda::FarnebackOpticalFlow::setFastPyramids()']]], + ['setfastthreshold_450',['setFastThreshold',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#abc0be00ff58954f680c66e7703d842f0',1,'cv::ORB::setFastThreshold()'],['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#af692ce9bbe10838f92d40335151251bf',1,'cv::cuda::ORB::setFastThreshold()']]], + ['setfdsize_451',['setFDSize',['https://docs.opencv.org/4.2.0/d5/d72/classcv_1_1ximgproc_1_1ContourFitting.html#a15d09cb24987736bf9bbb9241170da0f',1,'cv::ximgproc::ContourFitting']]], + ['setfeaturedesc_452',['setFeatureDesc',['https://docs.opencv.org/4.2.0/de/db5/structHaarClassifierNode128.html#aa978dba6f257f99c200633a9e2be56c4',1,'HaarClassifierNode128']]], + ['setfeaturedetector_453',['setFeatureDetector',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a8bb63fb54c4d07790c4501b8e09db92e',1,'cv::ccalib::CustomPattern']]], + ['setfeatureextractor_454',['setFeatureExtractor',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#addc69a1f46fb1b037438802c90bf640a',1,'cv::TrackerKCF']]], + ['setfeatures_455',['setFeatures',['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html#a2dfb54d37bcd3c30cb9200b0852be2a2',1,'cv::TrackerStateEstimatorMILBoosting::TrackerMILTargetState']]], + ['setfeaturesfinder_456',['setFeaturesFinder',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a943d01c149aa987e289f6be9b63d4e4b',1,'cv::Stitcher']]], + ['setfeaturesmatcher_457',['setFeaturesMatcher',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ada7fb8b0e696bfe3104f73d07ab0b5c4',1,'cv::Stitcher']]], + ['setfgslambda_458',['setFGSLambda',['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#ab3330056c1e6b07e15172cd8faba0f10',1,'cv::ximgproc::EdgeAwareInterpolator::setFGSLambda()'],['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a64f56bd383d752f9a7f8754d57d05f88',1,'cv::ximgproc::RICInterpolator::setFGSLambda()']]], + ['setfgslambda_459',['setFgsLambda',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#ab067f2d36dda3a951dd2788d1d3db404',1,'cv::optflow::DenseRLOFOpticalFlow']]], + ['setfgssigma_460',['setFGSSigma',['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#adc63515cb3306cf4de5ae8e2986e3358',1,'cv::ximgproc::EdgeAwareInterpolator::setFGSSigma()'],['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a3418698f404f83b66114ccdf3cf69e1c',1,'cv::ximgproc::RICInterpolator::setFGSSigma()']]], + ['setfgssigma_461',['setFgsSigma',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a0160ff5b02b666b5ced648241137ab43',1,'cv::optflow::DenseRLOFOpticalFlow']]], + ['setfill_462',['setfill',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af02c6886dba8d934606592e0f3e11d5c',1,'std']]], + ['setfillfactor_463',['setFillfactor',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteLUT.html#a327767d12b55ff8a023f12a030051e17',1,'Eigen::IncompleteLUT']]], + ['setfindlargestobject_464',['setFindLargestObject',['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a39e517368b8b95f40b5b9c07778f38c4',1,'cv::cuda::CascadeClassifier']]], + ['setfinestscale_465',['setFinestScale',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a802aad5131797bc8d97b8715d83c9dc1',1,'cv::DISOpticalFlow']]], + ['setfirstlevel_466',['setFirstLevel',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a2771f3db7f2a2d5340ba26775f59d331',1,'cv::ORB']]], + ['setfixedpointiterations_467',['setFixedPointIterations',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#af3ce307e3f8628c5d621f420c883a75a',1,'cv::VariationalRefinement']]], + ['setflags_468',['setFlags',['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#a1297d4b32eeae6c61f90ca1ab47b66ea',1,'cv::FarnebackOpticalFlow::setFlags()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#a45e787a5305d6ce6e7cb119aa2d31a6d',1,'cv::cuda::FarnebackOpticalFlow::setFlags()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#adbbe97ca07eb1175ffc6bd9dc4092327',1,'cv::superres::FarnebackOpticalFlow::setFlags()'],['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html#aae8dae87e3609e80b9f8a2ef3d68b51c',1,'cv::SparsePyrLKOpticalFlow::setFlags()'],['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a4a7e562d10be02f026af8492778c50b5',1,'cv::instr::setFlags(FLAGS modeFlags)'],['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab969571185d4fec9f235ff5b2febf280',1,'cv::instr::setFlags(int modeFlags)']]], + ['setflowerrorthreshold_469',['setFlowErrorThreshold',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#a3421c028fcdc3646969be927d5b6a0e7',1,'cv::videostab::MotionInpainter']]], + ['setflowsmoothness_470',['setFlowSmoothness',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#a14f843e96bc75a2580cbc4da489affdf',1,'cv::cuda::BroxOpticalFlow']]], + ['setforwardbackward_471',['setForwardBackward',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a17a0a5f547951b23c2e2de91516c4d86',1,'cv::optflow::DenseRLOFOpticalFlow::setForwardBackward()'],['https://docs.opencv.org/4.2.0/df/dc4/classcv_1_1optflow_1_1SparseRLOFOpticalFlow.html#a077ba6fe986801476d83fcfbe9d4b908',1,'cv::optflow::SparseRLOFOpticalFlow::setForwardBackward()']]], + ['setfov_472',['setFov',['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#a57adc00dd7c597cdb41e8f4b05650334',1,'cv::viz::Camera']]], + ['setfrac_473',['setFrac',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4a950579c5ad9d00e235f4d4dba79308',1,'cv::softdouble::setFrac()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga356bf2e1eb0897c509af1a02dc23f1f5',1,'cv::softfloat::setFrac()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga356bf2e1eb0897c509af1a02dc23f1f5',1,'setFrac(const softfloat &s) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4a950579c5ad9d00e235f4d4dba79308',1,'setFrac(const softdouble &s) const(Global Namespace)']]], + ['setframecount_474',['setFrameCount',['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#aa58c2478a945594504e1efd17bcf2a9a',1,'cv::videostab::WobbleSuppressorBase']]], + ['setframemask_475',['setFrameMask',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html#ac82d2de9d188ca96e6e7e0455cfa079a',1,'cv::videostab::ImageMotionEstimatorBase::setFrameMask()'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#aa1ad1af1c82b1231a81db24512e81221',1,'cv::videostab::KeypointBasedMotionEstimator::setFrameMask()'],['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html#ac6c1414027021c240767cfceaef7f10f',1,'cv::videostab::ToFileMotionWriter::setFrameMask()']]], + ['setframes_476',['setFrames',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a2449d268c8bd111c6250175c5bcca77d',1,'cv::videostab::DeblurerBase::setFrames()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a9c9c42ea041ec6e67db0041df4e022c8',1,'cv::videostab::InpainterBase::setFrames()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a4ef1cc113b04949c32bce6629dad6f70',1,'cv::videostab::InpaintingPipeline::setFrames()']]], + ['setframesize_477',['setFrameSize',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a79c7c7ff5d2fa5ad71acef8e719765e9',1,'cv::videostab::LpMotionStabilizer']]], + ['setframesource_478',['setFrameSource',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a107e9f7960b7efd7e210b5e178118021',1,'cv::videostab::StabilizerBase']]], + ['setfromtriplets_479',['setFromTriplets',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#acc35051d698e3973f1de5b9b78dbe345',1,'Eigen::SparseMatrix::setFromTriplets(const InputIterators &begin, const InputIterators &end)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3eee2d3d2a9843cd095c0207f781e7e',1,'Eigen::SparseMatrix::setFromTriplets(const InputIterators &begin, const InputIterators &end, DupFunctor dup_func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#acc35051d698e3973f1de5b9b78dbe345',1,'SparseMatrix< Scalar >::setFromTriplets(const InputIterators &begin, const InputIterators &end)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3eee2d3d2a9843cd095c0207f781e7e',1,'SparseMatrix< Scalar >::setFromTriplets(const InputIterators &begin, const InputIterators &end, DupFunctor dup_func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#acc35051d698e3973f1de5b9b78dbe345',1,'SparseMatrix< Scalar, ColMajor, int >::setFromTriplets(const InputIterators &begin, const InputIterators &end)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3eee2d3d2a9843cd095c0207f781e7e',1,'SparseMatrix< Scalar, ColMajor, int >::setFromTriplets(const InputIterators &begin, const InputIterators &end, DupFunctor dup_func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#acc35051d698e3973f1de5b9b78dbe345',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::setFromTriplets(const InputIterators &begin, const InputIterators &end)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3eee2d3d2a9843cd095c0207f781e7e',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::setFromTriplets(const InputIterators &begin, const InputIterators &end, DupFunctor dup_func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#acc35051d698e3973f1de5b9b78dbe345',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::setFromTriplets(const InputIterators &begin, const InputIterators &end)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3eee2d3d2a9843cd095c0207f781e7e',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::setFromTriplets(const InputIterators &begin, const InputIterators &end, DupFunctor dup_func)']]], + ['setfromtwovectors_480',['setFromTwoVectors',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7ae84bfbcc9f3f19f10294496a836bee',1,'Eigen::QuaternionBase::setFromTwoVectors()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7ae84bfbcc9f3f19f10294496a836bee',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::setFromTwoVectors()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7ae84bfbcc9f3f19f10294496a836bee',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::setFromTwoVectors()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a7ae84bfbcc9f3f19f10294496a836bee',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::setFromTwoVectors()']]], + ['setfullaffine_481',['setFullAffine',['https://docs.opencv.org/4.2.0/dc/d83/classcv_1_1AffineTransformer.html#af564eade3ef6b5c6cc7983228a4d5d99',1,'cv::AffineTransformer']]], + ['setfullscreen_482',['setFullScreen',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a29ea9ecc93aa5b02d616e5896ca40214',1,'cv::viz::Viz3d']]], + ['setfunction_483',['setFunction',['https://docs.opencv.org/4.2.0/df/d11/classcv_1_1MinProblemSolver.html#a22632a6392d2e159a8e01c2ed697cbe0',1,'cv::MinProblemSolver']]], + ['setg_484',['setg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'__gnu_cxx::enc_filebuf::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'__gnu_cxx::stdio_filebuf::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'__gnu_cxx::stdio_sync_filebuf::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'basic_filebuf< char_type, traits_type >::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'basic_streambuf< _Elem, _Tr >::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'basic_streambuf< char, _Traits >::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'basic_streambuf< char, char_traits< char > >::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'std::basic_filebuf::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'std::basic_streambuf::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'std::basic_stringbuf::setg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38c9b562c20b30bf9d21cf0e4dc90356',1,'std::wbuffer_convert::setg()']]], + ['setgains_485',['setGains',['../classcontrol_1_1PIDController.html#aea65837319357d27620c3ba2df9c5fa3',1,'control::PIDController']]], + ['setgamma_486',['setGamma',['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html#a2fecc011bc9656d088ccecf9e4f33e77',1,'cv::superres::BroxOpticalFlow::setGamma()'],['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#ad99682d2f2edf2c6be8feef5586cc5d6',1,'cv::optflow::DualTVL1OpticalFlow::setGamma()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a47d65e7c28908a80dd744363337b654b',1,'cv::ximgproc::EdgeBoxes::setGamma()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#ac52c588112632661ee6d17d14254f2ca',1,'cv::cuda::OpticalFlowDual_TVL1::setGamma()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a1e15d72e1bbba64a9650ea65910135e7',1,'cv::ml::SVM::setGamma()'],['https://docs.opencv.org/4.2.0/d8/d5e/classcv_1_1Tonemap.html#ac809d2967f942b038b4bf21c97f8b1b7',1,'cv::Tonemap::setGamma()'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#af549f9e93768f4e1ebc5cdec585586ec',1,'cv::VariationalRefinement::setGamma()']]], + ['setgammacorrection_487',['setGammaCorrection',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a0eb2f1ecf59ccc599bffac3a0a55562f',1,'cv::cuda::HOG']]], + ['setgldevice_488',['setGlDevice',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga7da4b94fc78501f4239c132901387730',1,'cv::cuda::setGlDevice()'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga7da4b94fc78501f4239c132901387730',1,'setGlDevice()(Global Namespace)']]], + ['setglobalmotionransacthreshold_489',['setGlobalMotionRansacThreshold',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#ac530a1661e5db651e3bdfa60cce8a1ac',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['setglobalwarnings_490',['setGlobalWarnings',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a25aa4d0064aadaf591de9fd5a710502f',1,'cv::viz::Viz3d']]], + ['setgradientconstancyimportance_491',['setGradientConstancyImportance',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#af4f9c30ced899e3f9c13414295227aeb',1,'cv::cuda::BroxOpticalFlow']]], + ['setgradientdescentiterations_492',['setGradientDescentIterations',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a184662b1f15fc3f7581bc61568a362fd',1,'cv::DISOpticalFlow']]], + ['setgrayscalebits_493',['setGrayscaleBits',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a1d9a4dd5b5b91d8e9f8195c7e496b9c3',1,'cv::xfeatures2d::PCTSignatures']]], + ['setgridlinesnumber_494',['setGridLinesNumber',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#ab2b90907daef5a058b4ceedf4dc0bca5',1,'cv::plot::Plot2d']]], + ['setgridstep_495',['setGridStep',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a11293fe3836fa27ab6cab491da2a4296',1,'cv::optflow::DenseRLOFOpticalFlow']]], + ['setgridx_496',['setGridX',['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html#ad65975baee31dbf3bd2a750feef74831',1,'cv::face::LBPHFaceRecognizer']]], + ['setgridy_497',['setGridY',['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html#a9cebb0138dbb3553b27beb2df3924ae6',1,'cv::face::LBPHFaceRecognizer']]], + ['setgroupthreshold_498',['setGroupThreshold',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#adad9af4e4ed0e0a045a70cd44520eefd',1,'cv::cuda::HOG']]], + ['sethalidescheduler_499',['setHalideScheduler',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a56fbff351d1e0a47fb5aabf6915fc279',1,'cv::dnn::Net']]], + ['setharrisdetector_500',['setHarrisDetector',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#ae91924c613b0736f338ae541d7c51a4e',1,'cv::GFTTDetector']]], + ['setheartbeattimedouthandler_501',['setHeartbeatTimedOutHandler',['../classnet_1_1websocket_1_1WebSocketProtocol.html#ae7ab0bf75c4a72f14330f5c8c3c3ff43',1,'net::websocket::WebSocketProtocol']]], + ['sethessianthreshold_502',['setHessianThreshold',['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html#a8b788ad30c4d395f5f7f3cdb98126c09',1,'cv::xfeatures2d::SURF']]], + ['sethighthreshold_503',['setHighThreshold',['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html#a63d352fe7f3bad640e63f4e394619235',1,'cv::cuda::CannyEdgeDetector']]], + ['sethistbinnum_504',['setHistBinNum',['https://docs.opencv.org/4.2.0/d4/d3b/classcv_1_1xphoto_1_1LearningBasedWB.html#a3381bd425bc4201133c9669071908e7f',1,'cv::xphoto::LearningBasedWB']]], + ['sethistory_505',['setHistory',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#adc3ce00b7ff6061ec0d255405aa1625f',1,'cv::BackgroundSubtractorKNN::setHistory()'],['https://docs.opencv.org/4.2.0/d6/da7/classcv_1_1bgsegm_1_1BackgroundSubtractorMOG.html#a1f4ce27ad2f4859b69f3b8232dc265c2',1,'cv::bgsegm::BackgroundSubtractorMOG::setHistory()'],['https://docs.opencv.org/4.2.0/d1/dfe/classcv_1_1cuda_1_1BackgroundSubtractorMOG.html#a552f9cfa624f79859ace02fa21dcf6cc',1,'cv::cuda::BackgroundSubtractorMOG::setHistory()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a5e8b40fef89a582ce42d99d2453db67a',1,'cv::BackgroundSubtractorMOG2::setHistory()']]], + ['sethitthreshold_506',['setHitThreshold',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a8b623393c11d18b89fa373269b97aea4',1,'cv::cuda::HOG']]], + ['sethostdirty_507',['setHostDirty',['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#a4c5604039feba47dd6d93e50a1ec130c',1,'cv::dnn::BackendWrapper']]], + ['setidentity_508',['setIdentity',['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a58fabb4849fa44233c21f088ac33aa06',1,'Eigen::DiagonalMatrix::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a0b2d7eb480c889693fb31fbdb02d9c09',1,'Eigen::DiagonalMatrix::setIdentity(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a18e969adfdf2db4ac44c47fbdc854683',1,'Eigen::MatrixBase::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a97dec020729928e328fe8ae9aad1e99e',1,'Eigen::MatrixBase::setIdentity(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a18e969adfdf2db4ac44c47fbdc854683',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a97dec020729928e328fe8ae9aad1e99e',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::setIdentity(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a18e969adfdf2db4ac44c47fbdc854683',1,'MatrixBase< Solve< Decomposition, RhsType > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a97dec020729928e328fe8ae9aad1e99e',1,'MatrixBase< Solve< Decomposition, RhsType > >::setIdentity(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a6805bb75fd7966ea71895c24ff196444',1,'Eigen::PermutationBase::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a830a80511a61634ef437795916f7f8da',1,'Eigen::PermutationBase::setIdentity(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a6805bb75fd7966ea71895c24ff196444',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a830a80511a61634ef437795916f7f8da',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::setIdentity(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a6805bb75fd7966ea71895c24ff196444',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a830a80511a61634ef437795916f7f8da',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::setIdentity(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a6805bb75fd7966ea71895c24ff196444',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a830a80511a61634ef437795916f7f8da',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::setIdentity(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a6805bb75fd7966ea71895c24ff196444',1,'PermutationBase< PermutationWrapper< _IndicesType > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a830a80511a61634ef437795916f7f8da',1,'PermutationBase< PermutationWrapper< _IndicesType > >::setIdentity(Index newSize)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a4695b0f6eebfb217ae2fbd579ceda24a',1,'Eigen::QuaternionBase::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a4695b0f6eebfb217ae2fbd579ceda24a',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a4695b0f6eebfb217ae2fbd579ceda24a',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a4695b0f6eebfb217ae2fbd579ceda24a',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a89013d2aa58413672c90932607a0d6f0',1,'Eigen::SparseMatrix::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a89013d2aa58413672c90932607a0d6f0',1,'SparseMatrix< Scalar >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a89013d2aa58413672c90932607a0d6f0',1,'SparseMatrix< Scalar, ColMajor, int >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a89013d2aa58413672c90932607a0d6f0',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a89013d2aa58413672c90932607a0d6f0',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::setIdentity()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#accf8eb8ac609d20cf099c62124c0505a',1,'Eigen::Transform::setIdentity()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga388d7575224a4a277ceb98ccaa327c99',1,'cv::setIdentity()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga388d7575224a4a277ceb98ccaa327c99',1,'setIdentity()(Global Namespace)']]], + ['setimage_509',['setImage',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a15cca93757ada6866173cdb91da9dae1',1,'cv::CvFeatureEvaluator::setImage()'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a20cf619f2ead04d968406d68b285084e',1,'cv::CvHaarEvaluator::setImage()'],['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#afe4152b207830ea1e86d5ad653664a05',1,'cv::CvHOGEvaluator::setImage()'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#a97a4d6f1937d0204e7a76d5970274bf8',1,'cv::CvLBPEvaluator::setImage()'],['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategy.html#a0f0668bc6e5759374a4b324e328dc13e',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentationStrategy::setImage()'],['https://docs.opencv.org/4.2.0/d7/d3d/classcv_1_1viz_1_1WImage3D.html#ab102aeb6a8c7cd993b22634ff03585d9',1,'cv::viz::WImage3D::setImage()'],['https://docs.opencv.org/4.2.0/d8/d33/classcv_1_1viz_1_1WImageOverlay.html#a6d18fe29e23944bdca21751acb906c13',1,'cv::viz::WImageOverlay::setImage()']]], + ['setimageappearanceweight_510',['setImageAppearanceWeight',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a92798b785faa75fb7e41c2cee8ac19db',1,'cv::ShapeContextDistanceExtractor']]], + ['setimageheight_511',['setImageHeight',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#aece9eba7fc039fb64a7f9b20e4763625',1,'cv::saliency::MotionSaliencyBinWangApr2014::setImageHeight()'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#ab42ba04a0cf4941d3ce46be51b802924',1,'cv::saliency::StaticSaliencySpectralResidual::setImageHeight()']]], + ['setimages_512',['setImages',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#abf94ec647328dcdf648157933f6f32b1',1,'cv::ShapeContextDistanceExtractor']]], + ['setimagesize_513',['setImagesize',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a9c7cf4b521ce10417bab29a33412881f',1,'cv::saliency::MotionSaliencyBinWangApr2014']]], + ['setimagewidth_514',['setImageWidth',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a81bacd9f5e1c41487da3f3c3d863d04d',1,'cv::saliency::MotionSaliencyBinWangApr2014::setImageWidth()'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#ae0bb047d91f20474d5fffb7260ac0750',1,'cv::saliency::StaticSaliencySpectralResidual::setImageWidth()']]], + ['setindicator_515',['setIndicator',['../namespacerobot.html#af3ae6c262d2a799a63437ed2ba481abb',1,'robot']]], + ['setinferenceenginebackendtype_516',['setInferenceEngineBackendType',['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a9caa7da18447ff7850ca962706482ec7',1,'cv::dnn']]], + ['setinitialmask_517',['setInitialMask',['https://docs.opencv.org/4.2.0/d2/da2/classcv_1_1TrackerCSRT.html#a0f35096b888cbd280a2b0c9bc0f94a3c',1,'cv::TrackerCSRT']]], + ['setinitialshift_518',['setInitialShift',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a409c9586e7d29566dda2c8f5e38a1228',1,'Eigen::IncompleteCholesky']]], + ['setinitialstepsize_519',['setInitialStepSize',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#abdba737e4293665f091f6433631f4dc9',1,'cv::ml::SVMSGD']]], + ['setinitseedindexes_520',['setInitSeedIndexes',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a0aa3ed847a3bd993e34a9bdb294212f5',1,'cv::xfeatures2d::PCTSignatures']]], + ['setinitstep_521',['setInitStep',['https://docs.opencv.org/4.2.0/d4/d43/classcv_1_1DownhillSolver.html#ab8038b328aee43b07760a346cebdc5a6',1,'cv::DownhillSolver']]], + ['setinneriterations_522',['setInnerIterations',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#ae765e5fad39a6660e7c7801e34c5f097',1,'cv::cuda::BroxOpticalFlow::setInnerIterations()'],['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html#aff45839677bd5deee3929db5923a1524',1,'cv::superres::BroxOpticalFlow::setInnerIterations()'],['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a369a6704fbf5448bdccc8269381d079f',1,'cv::optflow::DualTVL1OpticalFlow::setInnerIterations()']]], + ['setinnerradius_523',['setInnerRadius',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a1b9f6425a00d927f87ba77fb14b240bd',1,'cv::ShapeContextDistanceExtractor']]], + ['setinpainter_524',['setInpainter',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#add20a4cf58f541dbafcaa290a3c35f16',1,'cv::videostab::StabilizerBase']]], + ['setinput_525',['setInput',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a5e74adacffd6aa53d56046581de7fcbd',1,'cv::dnn::Net::setInput()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ac925acc676cb1141c801fa99eed66373',1,'cv::superres::SuperResolution::setInput()']]], + ['setinputcrop_526',['setInputCrop',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#af441526f30e98e84ebcd568aac7edc99',1,'cv::dnn::Model']]], + ['setinputmax_527',['setInputMax',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a6b2523a8740b353ef50e136d0399bf3a',1,'cv::xphoto::SimpleWB']]], + ['setinputmean_528',['setInputMean',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#abe381973a9b364eeade4b1cc30561cc8',1,'cv::dnn::Model']]], + ['setinputmin_529',['setInputMin',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a1b08a24a8589aae886fbf96ba27691a0',1,'cv::xphoto::SimpleWB']]], + ['setinputparams_530',['setInputParams',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a3af51e4292f8cbce196df311254826c2',1,'cv::dnn::Model']]], + ['setinputscale_531',['setInputScale',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a33c970dd73ba040819b08914bd83cc20',1,'cv::dnn::Model']]], + ['setinputsize_532',['setInputSize',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a8079e4b591dc8b04827d812600cf33e6',1,'cv::dnn::Model::setInputSize(const Size &size)'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#ac4dbf2e0c9a06ca5a973c42c7988b79e',1,'cv::dnn::Model::setInputSize(int width, int height)']]], + ['setinputsnames_533',['setInputsNames',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a4331f0fa17fd90db99cb68752c796fed',1,'cv::dnn::Net']]], + ['setinputswaprb_534',['setInputSwapRB',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a796ef4ba475bf705dad3cc8a5dac058d',1,'cv::dnn::Model']]], + ['setintensity_535',['setIntensity',['https://docs.opencv.org/4.2.0/d0/dec/classcv_1_1TonemapReinhard.html#af5d99afbaeb6ab1729e749504876fe34',1,'cv::TonemapReinhard']]], + ['setinterpolation_536',['setInterpolation',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a06cb0e2b59a8a3505c30b78bd3e7b2c3',1,'cv::optflow::DenseRLOFOpticalFlow']]], + ['setinterpolationflags_537',['setInterpolationFlags',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a253d04b8dcd3c674321b29139c769873',1,'cv::Stitcher']]], + ['setinvertorientation_538',['setInvertOrientation',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a81b27f15f7975042dc1d259c64435401',1,'cv::plot::Plot2d']]], + ['setiosflags_539',['setiosflags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab27c01e21b835749650e5f2ed2d16dbc',1,'std']]], + ['setisclassifier_540',['setIsClassifier',['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#adf7439615632c768fa0bd448615e09e8',1,'cv::ml::KNearest']]], + ['setisparallel_541',['setIsParallel',['https://docs.opencv.org/4.2.0/de/dca/classcv_1_1bgsegm_1_1BackgroundSubtractorCNT.html#a06427b5eecbfe5309cb00beb85f98cdb',1,'cv::bgsegm::BackgroundSubtractorCNT']]], + ['setiterationcount_542',['setIterationCount',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#aa2f1491f6cc4f99feed74a55c84a6950',1,'cv::xfeatures2d::PCTSignatures']]], + ['setiterationcounts_543',['setIterationCounts',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a4b330f0a4fe9af02ed5900b847bfea97',1,'cv::rgbd::FastICPOdometry::setIterationCounts()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a6287107408f045c34f9148f01b64638a',1,'cv::rgbd::ICPOdometry::setIterationCounts()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a14f7bb9d50983879e1a15843af08ad28',1,'cv::rgbd::RgbdICPOdometry::setIterationCounts()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a791fea684d3e44fa16b6e52705a51867',1,'cv::rgbd::RgbdOdometry::setIterationCounts()']]], + ['setiterations_544',['setIterations',['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#a2dc4023cdb6ab026d1a0d7094b4ad550',1,'cv::superres::DualTVL1OpticalFlow::setIterations()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#a71dbb1f03c461f5bea5cb06d371cbe7f',1,'cv::superres::FarnebackOpticalFlow::setIterations()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a77ecde450d828a236b77681f6cd375d8',1,'cv::ml::LogisticRegression::setIterations()'],['https://docs.opencv.org/4.2.0/de/d2b/classcv_1_1superres_1_1PyrLKOpticalFlow.html#a35f61e6b28f4f757e33da5be45ef89b3',1,'cv::superres::PyrLKOpticalFlow::setIterations()'],['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#ac90e93665a0d5d27a69dfef3f47b4255',1,'cv::ShapeContextDistanceExtractor::setIterations()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a6ca6d26088cadd9c178afd0fdfc2efb9',1,'cv::superres::SuperResolution::setIterations()']]], + ['setjoiningdistance_545',['setJoiningDistance',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a3b34e63ce62c9759d7a9747ba6549a78',1,'cv::xfeatures2d::PCTSignatures']]], + ['setjointpos_546',['setJointPos',['../namespacerobot.html#a22bae8dc460f5d2413092e99d59c6c07',1,'robot']]], + ['setjointpower_547',['setJointPower',['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html#a03c0709ff0e80f3921da8b7f4dd71f59',1,'net::mc::tasks::PowerRepeatTask']]], + ['setk_548',['setK',['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#a4b3f18fdfaae3b89fa4384dc7dec9229',1,'cv::ximgproc::EdgeAwareInterpolator::setK()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#a54427c38033b6c2de48c6a49b085ec29',1,'cv::GFTTDetector::setK()'],['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1ximgproc_1_1segmentation_1_1GraphSegmentation.html#afb0158f535ad5636161c3e4d6a6c7fb1',1,'cv::ximgproc::segmentation::GraphSegmentation::setK()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a667dc339ea0262412c399fa348daa605',1,'cv::rgbd::RgbdNormals::setK()'],['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a396da659ac5ee155802c46e1e96e6720',1,'cv::ximgproc::RICInterpolator::setK()']]], + ['setkappa_549',['setKappa',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a6dd86f3ac7ffd5d40034af9c6cc9b397',1,'cv::ximgproc::EdgeBoxes']]], + ['setkernel_550',['setKernel',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ad6f4f45983d06817b9782978ca0f6f6f',1,'cv::ml::SVM']]], + ['setkernelparam_551',['setKernelParam',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1img__hash_1_1MarrHildrethHash.html#a94ac77193c92d93af6bf0f9f7eaf2df2',1,'cv::img_hash::MarrHildrethHash']]], + ['setkernelsize_552',['setKernelSize',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a0f46fb0684a6bfe66ea36f3ca391c6cf',1,'cv::rgbd::FastICPOdometry::setKernelSize()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ab11a31f01e6df91838866e4ff35e6289',1,'cv::superres::SuperResolution::setKernelSize()']]], + ['setknnsamples_553',['setkNNSamples',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#acac38a02b7b32add859fbe78ef01b4ec',1,'cv::BackgroundSubtractorKNN']]], + ['setl2gradient_554',['setL2Gradient',['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html#ac2e8a675cc30cb3e621ac684e22f89d1',1,'cv::cuda::CannyEdgeDetector']]], + ['setl2hysthreshold_555',['setL2HysThreshold',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a30e5c88864fff774f403313993947d62',1,'cv::cuda::HOG']]], + ['setlabelinfo_556',['setLabelInfo',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#aabcb47adcddd719974681b2b7309d656',1,'cv::face::FaceRecognizer']]], + ['setlambda_557',['setLambda',['https://docs.opencv.org/4.2.0/da/d27/classcv_1_1CalibrateDebevec.html#ab2b47092bbe6234b8a046cd7104cdf77',1,'cv::CalibrateDebevec::setLambda()'],['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1ximgproc_1_1DisparityWLSFilter.html#af31f80b7fd9a7617377f2d8ff00ddee4',1,'cv::ximgproc::DisparityWLSFilter::setLambda()'],['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#accaa548e430fb147636dc8490f814d76',1,'cv::optflow::DualTVL1OpticalFlow::setLambda()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#a7d29592d5d4bbc8259d47182446ab372',1,'cv::superres::DualTVL1OpticalFlow::setLambda()'],['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#a57552468f71996f29062bd2a9eab6606',1,'cv::ximgproc::EdgeAwareInterpolator::setLambda()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#a41f3031da66ac69d44ef491ad9bc4417',1,'cv::cuda::OpticalFlowDual_TVL1::setLambda()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ad168b5c627c8bb291bc7d759c888dc98',1,'cv::superres::SuperResolution::setLambda()']]], + ['setlargewinsize_558',['setLargeWinSize',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a327582bea4742163dcf699ce5e9102c2',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['setlasttargetstate_559',['setLastTargetState',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a8be4baadf82e4d35b6aaf25eb19aa685',1,'cv::TrackerModel']]], + ['setlayersizes_560',['setLayerSizes',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a79731c3fd3168e28eb3c3bba7a2caa94',1,'cv::ml::ANN_MLP']]], + ['setlearningrate_561',['setLearningRate',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a1d050c28ca1fba9439961f76ba526cec',1,'cv::ml::LogisticRegression']]], + ['setleftnodedesc_562',['setLeftNodeDesc',['https://docs.opencv.org/4.2.0/de/db5/structHaarClassifierNode128.html#ae947fbf30026b45adc0802d799eaafe7',1,'HaarClassifierNode128']]], + ['setlength_563',['setLength',['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#a30cc06d5b2ca4b7dcf5fcd53313d25fc',1,'Eigen::HouseholderSequence']]], + ['setlevels_564',['setLevels',['https://docs.opencv.org/4.2.0/dc/d46/classcv_1_1GeneralizedHoughBallard.html#a234280317b918a2e439703a70abf55b1',1,'cv::GeneralizedHoughBallard::setLevels()'],['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#aef797ae7c1f6db4648cd85174f8d8f93',1,'cv::GeneralizedHoughGuil::setLevels()']]], + ['setlevelsnumber_565',['setLevelsNumber',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#a7fe7f02976e2e2b280058dabf8836aab',1,'cv::superres::FarnebackOpticalFlow']]], + ['setlightadaptation_566',['setLightAdaptation',['https://docs.opencv.org/4.2.0/d0/dec/classcv_1_1TonemapReinhard.html#a31feb20a5527923a55d463e25fcbc030',1,'cv::TonemapReinhard']]], + ['setlimitswitchlimits_567',['setLimitSwitchLimits',['../namespacecan_1_1motor.html#aaeed0f12c1b4d0867d8731cf19dbf40e',1,'can::motor']]], + ['setlinspaced_568',['setLinSpaced',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb023532476d3f14c457367e0eb5f3f1',1,'Eigen::DenseBase::setLinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5d1ce9e801fa502e02b9b8cd9141ad0a',1,'Eigen::DenseBase::setLinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb023532476d3f14c457367e0eb5f3f1',1,'DenseBase< ArrayWrapper< ExpressionType > >::setLinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5d1ce9e801fa502e02b9b8cd9141ad0a',1,'DenseBase< ArrayWrapper< ExpressionType > >::setLinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb023532476d3f14c457367e0eb5f3f1',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::setLinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5d1ce9e801fa502e02b9b8cd9141ad0a',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::setLinSpaced(Index size, const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb023532476d3f14c457367e0eb5f3f1',1,'DenseBase< Solve< Decomposition, RhsType > >::setLinSpaced(const Scalar &low, const Scalar &high)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5d1ce9e801fa502e02b9b8cd9141ad0a',1,'DenseBase< Solve< Decomposition, RhsType > >::setLinSpaced(Index size, const Scalar &low, const Scalar &high)']]], + ['setlog_569',['setLog',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ad5a4f03a204822a1f17dd0fe5da6317d',1,'cv::videostab::StabilizerBase']]], + ['setloglevel_570',['setLogLevel',['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html#gaa022dd6c6e2d72539cc1e5100bcb378b',1,'cv::utils::logging::setLogLevel()'],['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html#gaa022dd6c6e2d72539cc1e5100bcb378b',1,'setLogLevel()(Global Namespace)']]], + ['setlogtaglevel_571',['setLogTagLevel',['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html#ga0bc84211764950ce24c66a8274255e72',1,'cv::utils::logging::setLogTagLevel()'],['https://docs.opencv.org/4.2.0/d3/dcb/group__core__logging.html#ga0bc84211764950ce24c66a8274255e72',1,'setLogTagLevel()(Global Namespace)']]], + ['setlowthreshold_572',['setLowThreshold',['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html#a6bdc1479c1557288a69c6314c61d1548',1,'cv::cuda::CannyEdgeDetector']]], + ['setlrcthresh_573',['setLRCthresh',['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1ximgproc_1_1DisparityWLSFilter.html#a3456a95d3b37ed72f140df872aada113',1,'cv::ximgproc::DisparityWLSFilter']]], + ['setmarginregularization_574',['setMarginRegularization',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a2e16734e58800183162d1ab6d7d8fe7f',1,'cv::ml::SVMSGD']]], + ['setmargintype_575',['setMarginType',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a79385571c8163f5c0c157e7a7e607a0b',1,'cv::ml::SVMSGD']]], + ['setmarkers_576',['setMarkers',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#a1b8a00a40198b20bd935d499257267c6',1,'cv::structured_light::SinusoidalPattern::Params']]], + ['setmaskcallback_577',['setMaskCallback',['https://docs.opencv.org/4.2.0/da/d26/classcv_1_1videostab_1_1MaskFrameSource.html#ac12698a6512574b5af3bec2f87b615cc',1,'cv::videostab::MaskFrameSource']]], + ['setmaskgenerator_578',['setMaskGenerator',['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#aa99dc34bdd04563d7adc1343dac6f300',1,'cv::BaseCascadeClassifier::setMaskGenerator()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a7628a59eefb561ecd79ad9d02bd69073',1,'cv::CascadeClassifier::setMaskGenerator()']]], + ['setmasksource_579',['setMaskSource',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a2cbb83ddf5c875ee83d88b75d00535c7',1,'cv::videostab::StabilizerBase']]], + ['setmatchingmask_580',['setMatchingMask',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad1591614305b0385f8a6152458f93955',1,'cv::Stitcher']]], + ['setmaterialproperty_581',['setMaterialProperty',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gaf7aaaa30b9398b06721d5d5971b9590b',1,'cv::ovis::setMaterialProperty(const String &name, int prop, const Scalar &value)'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga329b3d975bf26644caf7928044800344',1,'cv::ovis::setMaterialProperty(const String &name, int prop, const String &value)'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga3dfac94809b957393480bac0c11ca214',1,'cv::ovis::setMaterialProperty(const String &name, const String &prop, const Scalar &value)'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gaf7aaaa30b9398b06721d5d5971b9590b',1,'setMaterialProperty(const String &name, int prop, const Scalar &value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga329b3d975bf26644caf7928044800344',1,'setMaterialProperty(const String &name, int prop, const String &value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga3dfac94809b957393480bac0c11ca214',1,'setMaterialProperty(const String &name, const String &prop, const Scalar &value)(Global Namespace)']]], + ['setmatgains_582',['setMatGains',['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a1b86c5b1bec92ce5a30092c6799f0fc5',1,'cv::detail::BlocksCompensator::setMatGains()'],['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html#a7eaadbd98afa74803b63bc149942dc7f',1,'cv::detail::BlocksGainCompensator::setMatGains()'],['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html#a85d57777086b146524334bc4224f9f80',1,'cv::detail::ChannelsCompensator::setMatGains()'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad961c342a0a216eeddafc198766b6c1c',1,'cv::detail::ExposureCompensator::setMatGains()'],['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#acbdf968e6b9b3631f612403ac874bedc',1,'cv::detail::GainCompensator::setMatGains()'],['https://docs.opencv.org/4.2.0/d2/dc1/classcv_1_1detail_1_1NoExposureCompensator.html#a09bc74443d890ce13c95d81818f122b9',1,'cv::detail::NoExposureCompensator::setMatGains()']]], + ['setmaxangle_583',['setMaxAngle',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a0f4173d9464cdbfa072d746747812431',1,'cv::GeneralizedHoughGuil']]], + ['setmaxarea_584',['setMaxArea',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#aac25336b802dd8abbb92ee6b4daf0e50',1,'cv::text::ERFilter::setMaxArea()'],['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#ad768e2445e6cdacd6ed28b5fb533a464',1,'cv::MSER::setMaxArea()']]], + ['setmaxaspectratio_585',['setMaxAspectRatio',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a756ff7bee5a3b29a2f628ad310b596b6',1,'cv::ximgproc::EdgeBoxes']]], + ['setmaxbits_586',['setMaxBits',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a6f55841ed6e1f9482483595008250560',1,'cv::AlignMTB']]], + ['setmaxboxes_587',['setMaxBoxes',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#ace0a64b9189f7fe56ae1baf0f6dafaf5',1,'cv::ximgproc::EdgeBoxes']]], + ['setmaxbuffersize_588',['setMaxBufferSize',['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#add9b562933707cbf7728b30961e2ff93',1,'cv::GeneralizedHough']]], + ['setmaxcategories_589',['setMaxCategories',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a6d1571c10e5d72f8df7f102b916d704f',1,'cv::ml::DTrees']]], + ['setmaxcircles_590',['setMaxCircles',['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#a9f72ef28244ce031f493d8bd0e45e1e2',1,'cv::cuda::HoughCirclesDetector']]], + ['setmaxclusterscount_591',['setMaxClustersCount',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a4450e6f3e2676caaf4c78c9da7e6af6f',1,'cv::xfeatures2d::PCTSignatures']]], + ['setmaxdataterm_592',['setMaxDataTerm',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#a170d8ce45fad99435290e7d6ca0c8968',1,'cv::cuda::StereoBeliefPropagation']]], + ['setmaxdepth_593',['setMaxDepth',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#ab2192b5631da2d30eaaebdb12015f477',1,'cv::ml::DTrees::setMaxDepth()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a9f6c17376dc49f8bef4a1cee771871b2',1,'cv::rgbd::ICPOdometry::setMaxDepth()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a91904d6d9836de919c0c607400405555',1,'cv::rgbd::RgbdICPOdometry::setMaxDepth()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#af4f7239c1d52191c9ec997881b5de6d6',1,'cv::rgbd::RgbdOdometry::setMaxDepth()']]], + ['setmaxdepthdiff_594',['setMaxDepthDiff',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#ad7bba84dc1f971c6773be51a1836a25c',1,'cv::rgbd::ICPOdometry::setMaxDepthDiff()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#aeb101180d45e9aa737b4a03de93277d6',1,'cv::rgbd::RgbdICPOdometry::setMaxDepthDiff()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a793e4fdd3dc15215247c5fcbd5f52494',1,'cv::rgbd::RgbdOdometry::setMaxDepthDiff()']]], + ['setmaxdiscterm_595',['setMaxDiscTerm',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#acbd5b1a9fc089e9ebed870d28a25579b',1,'cv::cuda::StereoBeliefPropagation']]], + ['setmaxdiscthreshold_596',['setMaxDiscThreshold',['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#a57ddf3159765877a10ef8e74cf751e36',1,'cv::cuda::DisparityBilateralFilter']]], + ['setmaxdisparity_597',['setMaxDisparity',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a9285d28d89a43015de95872775bc9a4b',1,'cv::stereo::Matching']]], + ['setmaxdistdiff_598',['setMaxDistDiff',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#aa9ff85e53affef56b1042942c47de94d',1,'cv::rgbd::FastICPOdometry']]], + ['setmaxfeatures_599',['setMaxFeatures',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a2995c5c498745fe9ef6c36dea27a9a97',1,'cv::bgsegm::BackgroundSubtractorGMG::setMaxFeatures()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a6052b93f375b02d1279fae04fb51e6f3',1,'cv::cuda::BackgroundSubtractorGMG::setMaxFeatures()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#ade841e3ce9dc7e0c23e90442a6ff13df',1,'cv::GFTTDetector::setMaxFeatures()'],['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#aca471cb82c03b14d3e824e4dcccf90b7',1,'cv::ORB::setMaxFeatures()']]], + ['setmaxflow_600',['setMaxFlow',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a901bcd2172fdb268418824feea796dd9',1,'cv::ximgproc::RICInterpolator']]], + ['setmaxiter_601',['setMaxIter',['https://docs.opencv.org/4.2.0/d3/d30/classcv_1_1CalibrateRobertson.html#af4065c5709a957ae36f4da78200ace01',1,'cv::CalibrateRobertson']]], + ['setmaxiteration_602',['setMaxIteration',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a581f6499ab4ed1d8ac30117723d2e7df',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['setmaxiterations_603',['setMaxIterations',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a0c5a974da17774d75be41e351e6bda62',1,'Eigen::ComplexEigenSolver::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a6ca227fbd5387f3a625351354b8eec44',1,'Eigen::ComplexSchur::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a6ca227fbd5387f3a625351354b8eec44',1,'ComplexSchur< MatrixType >::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a6cff220aadfd8d8c1366b915ddefd164',1,'Eigen::EigenSolver::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#a2a6f96bd042068cfc0eafba839b424bd',1,'Eigen::GeneralizedEigenSolver::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#af83de7a7d31d9d4bd1fef6222b07335b',1,'Eigen::IterativeSolverBase::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a30ae65666b1757e4a2b6a28eaec12226',1,'Eigen::RealQZ::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a30ae65666b1757e4a2b6a28eaec12226',1,'RealQZ< MatrixType >::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#ad189e8776ee20a12046694f98b354322',1,'Eigen::RealSchur::setMaxIterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#ad189e8776ee20a12046694f98b354322',1,'RealSchur< MatrixType >::setMaxIterations()']]], + ['setmaxiters_604',['setMaxIters',['https://docs.opencv.org/4.2.0/d3/d6d/classcv_1_1LMSolver.html#ab6985da1052df9a4b88e5dd0b7d34bec',1,'cv::LMSolver']]], + ['setmaxlevel_605',['setMaxLevel',['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1cuda_1_1DensePyrLKOpticalFlow.html#a591e61e5930a84d05cb789a34766b984',1,'cv::cuda::DensePyrLKOpticalFlow::setMaxLevel()'],['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html#a5d44ea309f365bd5be14ff855f246661',1,'cv::videostab::PyrLkOptFlowEstimatorBase::setMaxLevel()'],['https://docs.opencv.org/4.2.0/de/d2b/classcv_1_1superres_1_1PyrLKOpticalFlow.html#a4f2edc8e45f95994c04065eae4b99faf',1,'cv::superres::PyrLKOpticalFlow::setMaxLevel()'],['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a51fc4589ed64202038fafdd9324a90a2',1,'cv::optflow::RLOFOpticalFlowParameter::setMaxLevel()'],['https://docs.opencv.org/4.2.0/d7/d05/classcv_1_1cuda_1_1SparsePyrLKOpticalFlow.html#af592f24ff8a10313cb97d0dbd3b5f825',1,'cv::cuda::SparsePyrLKOpticalFlow::setMaxLevel()'],['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html#a7698f83b203e18781da3b46eeb0363d1',1,'cv::SparsePyrLKOpticalFlow::setMaxLevel()']]], + ['setmaxlinegap_606',['setMaxLineGap',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html#a23319b68e050918b52857a2815b57823',1,'cv::cuda::HoughSegmentDetector']]], + ['setmaxlines_607',['setMaxLines',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#afe1e1e89113e20a3eafcc0c76639798a',1,'cv::cuda::HoughLinesDetector::setMaxLines()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html#aa196bbf7cb2840ebd52b162adcd14509',1,'cv::cuda::HoughSegmentDetector::setMaxLines()']]], + ['setmaxnumobjects_608',['setMaxNumObjects',['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a7b86aedaf7ba94827b36bc3dbca6b323',1,'cv::cuda::CascadeClassifier']]], + ['setmaxnumpoints_609',['setMaxNumPoints',['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#adda718a41fddd6825ae8787d8e594567',1,'cv::cuda::FastFeatureDetector']]], + ['setmaxobjectsize_610',['setMaxObjectSize',['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#ab48f89668d33f9a0db3979351b66da20',1,'cv::cuda::CascadeClassifier::setMaxObjectSize()'],['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#ae2d73cf36e6f3882625576eb300a3712',1,'cv::DetectionBasedTracker::IDetector::setMaxObjectSize()']]], + ['setmaxpixelstability_611',['setMaxPixelStability',['https://docs.opencv.org/4.2.0/de/dca/classcv_1_1bgsegm_1_1BackgroundSubtractorCNT.html#a45447da072fb9ffeec62f3932e3b153c',1,'cv::bgsegm::BackgroundSubtractorCNT']]], + ['setmaxpixelvalue_612',['setMaxPixelValue',['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#ab11b13da4d0e5074e3cf9ab1dc9053b1',1,'cv::quality::QualityPSNR']]], + ['setmaxpointspart_613',['setMaxPointsPart',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a162a63aa33a447a11595296fd463ef7a',1,'cv::rgbd::ICPOdometry::setMaxPointsPart()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a7f046b11dcce8ea265c78d4c0209c505',1,'cv::rgbd::RgbdICPOdometry::setMaxPointsPart()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#afbeca1b304b4dbaa3e3bc89bbbddff81',1,'cv::rgbd::RgbdOdometry::setMaxPointsPart()']]], + ['setmaxradius_614',['setMaxRadius',['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#a287affcc09e29f3f4fe822b4c612fab1',1,'cv::cuda::HoughCirclesDetector']]], + ['setmaxreservedsize_615',['setMaxReservedSize',['https://docs.opencv.org/4.2.0/d4/dad/classcv_1_1BufferPoolController.html#a006b69935da9979e4e501117565e741b',1,'cv::BufferPoolController']]], + ['setmaxrotation_616',['setMaxRotation',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a0afd7b4b944978a1eb0efd8b3bd0c2fb',1,'cv::rgbd::ICPOdometry::setMaxRotation()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a530843e43b5b96461a883b384fc6d34a',1,'cv::rgbd::RgbdICPOdometry::setMaxRotation()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a4434c203116af42439814d5f7f4d028d',1,'cv::rgbd::RgbdOdometry::setMaxRotation()']]], + ['setmaxscale_617',['setMaxScale',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a65c1d3b008a9f5bb61d3d95adf4570cc',1,'cv::GeneralizedHoughGuil']]], + ['setmaxtranslation_618',['setMaxTranslation',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#ad4e04a2482e4e030dcf0670e1f25a8a1',1,'cv::rgbd::ICPOdometry::setMaxTranslation()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#aa6b99fadf368002a1c52c30ff1bce332',1,'cv::rgbd::RgbdICPOdometry::setMaxTranslation()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#ab4ec5d5cbe15102247ef4f96d6a13e28',1,'cv::rgbd::RgbdOdometry::setMaxTranslation()']]], + ['setmaxval_619',['setMaxVal',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a43268a30fb0145482972691a308e3745',1,'cv::bgsegm::BackgroundSubtractorGMG::setMaxVal()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a8aab0648eb6a57904ee63a319b618f39',1,'cv::cuda::BackgroundSubtractorGMG::setMaxVal()']]], + ['setmaxx_620',['setMaxX',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#ab3e573f72f8b2b9be1120ada692b9481',1,'cv::plot::Plot2d']]], + ['setmaxy_621',['setMaxY',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#afd8e2b5d0132e1442c2a7830b27b1e84',1,'cv::plot::Plot2d']]], + ['setmedianfiltering_622',['setMedianFiltering',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a1ca8b74445dc347b229c9bbb05f85a8f',1,'cv::optflow::DualTVL1OpticalFlow']]], + ['setmethod_623',['setMethod',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a642d2d765a87429235113b31538d2690',1,'cv::rgbd::DepthCleaner::setMethod()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a8322dd53b4b5e763fdae73f3795f1290',1,'cv::rgbd::RgbdNormals::setMethod()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#aa5402321410147ef5c9ae4771f22684d',1,'cv::rgbd::RgbdPlane::setMethod()']]], + ['setminangle_624',['setMinAngle',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a303a0eebee227d4b27ddf4a0ae211658',1,'cv::GeneralizedHoughGuil']]], + ['setminarea_625',['setMinArea',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a457ad45027b98ea259dddf8469958d68',1,'cv::text::ERFilter::setMinArea()'],['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#a90de7b99fcbcf2b184420dedcb5912b3',1,'cv::MSER::setMinArea()']]], + ['setminboxarea_626',['setMinBoxArea',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a6e6139e8b52e931c6b0aedb0c79cb3cd',1,'cv::ximgproc::EdgeBoxes']]], + ['setmindepth_627',['setMinDepth',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a6f0b190dc9d7e7f6c7c0ddc036a98085',1,'cv::rgbd::ICPOdometry::setMinDepth()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a3f3bdad40f449d5dcabcf3229bf86cbf',1,'cv::rgbd::RgbdICPOdometry::setMinDepth()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#aecb015d50e96cc83d8d021ac288ecd3f',1,'cv::rgbd::RgbdOdometry::setMinDepth()']]], + ['setmindisparity_628',['setMinDisparity',['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#ae67a506bfe7fbd37444b6713aea1c0ad',1,'cv::StereoMatcher::setMinDisparity()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#aae2525ed014e9a5a61485a1bc58622b3',1,'cv::stereo::StereoMatcher::setMinDisparity()']]], + ['setmindist_629',['setMinDist',['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a4a0b12ead2b701c2574d3354cd02d349',1,'cv::GeneralizedHough::setMinDist()'],['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#a58fff962c301faf3c7640b78070545e1',1,'cv::cuda::HoughCirclesDetector::setMinDist()']]], + ['setmindistance_630',['setMinDistance',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#a02d13a8b58df03f5165a9ca5262aae86',1,'cv::GFTTDetector']]], + ['setmineigenvalue_631',['setMinEigenValue',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a75c0aa8331325065b9ab95fe795be05b',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['setmineigthreshold_632',['setMinEigThreshold',['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html#aab2a4c2a318a1448d43b1a544c8be934',1,'cv::SparsePyrLKOpticalFlow']]], + ['setmingradientmagnitudes_633',['setMinGradientMagnitudes',['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a49d95e87df435be465ffa979733d97b9',1,'cv::rgbd::RgbdICPOdometry::setMinGradientMagnitudes()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#aea7b12bc88c1b6bb305bc1909d05b972',1,'cv::rgbd::RgbdOdometry::setMinGradientMagnitudes()']]], + ['setminibatchsize_634',['setMiniBatchSize',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a1ba3ea00151b9671534e65fe936402b2',1,'cv::ml::LogisticRegression']]], + ['setmininlierratio_635',['setMinInlierRatio',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#ab1d351054cc4adbbf9875156874fedd8',1,'cv::videostab::MotionEstimatorRansacL2']]], + ['setminlinelength_636',['setMinLineLength',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html#a447c927941b2eba54a76b73ac816f638',1,'cv::cuda::HoughSegmentDetector']]], + ['setminneighbors_637',['setMinNeighbors',['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#ab46735fa5ab7d20672665fbfaa6a442b',1,'cv::cuda::CascadeClassifier']]], + ['setminneighbours_638',['setMinNeighbours',['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#adfc30759564fd402d3d9a4dc30bcb798',1,'cv::DetectionBasedTracker::IDetector']]], + ['setminobjectsize_639',['setMinObjectSize',['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#aedf17c846fbf3e80fd80f213d3daa600',1,'cv::cuda::CascadeClassifier::setMinObjectSize()'],['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#a04fefc396886a457f4569660d4c66c0e',1,'cv::DetectionBasedTracker::IDetector::setMinObjectSize()']]], + ['setminpixelstability_640',['setMinPixelStability',['https://docs.opencv.org/4.2.0/de/dca/classcv_1_1bgsegm_1_1BackgroundSubtractorCNT.html#a17f664133da264400f4a87dc361a9f4d',1,'cv::bgsegm::BackgroundSubtractorCNT']]], + ['setminprobability_641',['setMinProbability',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a1d3a364456467554ae4ddae96d289de6',1,'cv::text::ERFilter']]], + ['setminprobabilitydiff_642',['setMinProbabilityDiff',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a3700dd942539b9bd86de0feaef3456d7',1,'cv::text::ERFilter']]], + ['setminradius_643',['setMinRadius',['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#a0cccc5738c37a5fb48757224ef144e10',1,'cv::cuda::HoughCirclesDetector']]], + ['setminregionsizei_644',['setMinRegionSizeI',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#aec3051481425596ce245adfe057605ef',1,'cv::hfs::HfsSegment']]], + ['setminregionsizeii_645',['setMinRegionSizeII',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#ae5b55d3546448628b94beab5a8c76126',1,'cv::hfs::HfsSegment']]], + ['setminsamplecount_646',['setMinSampleCount',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#abe34fc6e9a172b9e334abcca94e28fb6',1,'cv::ml::DTrees']]], + ['setminscale_647',['setMinScale',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#ac661ec2f0a3583f6a0577b3496c44ae0',1,'cv::GeneralizedHoughGuil']]], + ['setminscore_648',['setMinScore',['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1ximgproc_1_1EdgeBoxes.html#a71ed3438a7ebeb98e7154a6546b57927',1,'cv::ximgproc::EdgeBoxes']]], + ['setminsize_649',['setMinSize',['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1ximgproc_1_1segmentation_1_1GraphSegmentation.html#a27940f63af4381a5c2215c49f3f9d276',1,'cv::ximgproc::segmentation::GraphSegmentation::setMinSize()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a9f9cc2c6e54ce89965c9ce202c181208',1,'cv::rgbd::RgbdPlane::setMinSize()']]], + ['setminval_650',['setMinVal',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a10a0bafa8580ff3083be7a4fe05f55bf',1,'cv::bgsegm::BackgroundSubtractorGMG::setMinVal()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#aee733b0a696af37d123e1c0c47b2ab97',1,'cv::cuda::BackgroundSubtractorGMG::setMinVal()']]], + ['setminx_651',['setMinX',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a85abe289195196730e5cdb73c16e7821',1,'cv::plot::Plot2d']]], + ['setminy_652',['setMinY',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a76d23672f328558b3d9d4e14ad3bec1e',1,'cv::plot::Plot2d']]], + ['setmode_653',['setMode',['https://docs.opencv.org/4.2.0/df/d55/classcv_1_1img__hash_1_1BlockMeanHash.html#aac726ac99777a8250b9560120acee961',1,'cv::img_hash::BlockMeanHash::setMode()'],['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a04e347de4f882dd8824ef6d673584560',1,'cv::stereo::StereoBinarySGBM::setMode()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#a32617c11dbdac9b689711a38cd928017',1,'cv::StereoSGBM::setMode()'],['https://docs.opencv.org/4.2.0/da/d3e/classcv_1_1TrackerSamplerCS.html#a6a89c1a694cd60dd98e7ae2cec492068',1,'cv::TrackerSamplerCS::setMode()'],['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#afbee269d2fbcdf6d76fae512d157b606',1,'cv::TrackerSamplerCSC::setMode()']]], + ['setmodel_654',['setModel',['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1dnn__superres_1_1DnnSuperResImpl.html#a1310dbcef0e4d59d7342d9b9d0ddcef7',1,'cv::dnn_superres::DnnSuperResImpl']]], + ['setmodeliter_655',['setModelIter',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#afd78f4175df04c60b7c4485642fb2a4f',1,'cv::ximgproc::RICInterpolator']]], + ['setmotionestimator_656',['setMotionEstimator',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a6e8c33ea40e8dde5b5083c16338307c6',1,'cv::videostab::StabilizerBase::setMotionEstimator()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a1d219dd75f827edc8128c84a66f6242e',1,'cv::videostab::WobbleSuppressorBase::setMotionEstimator()']]], + ['setmotionfilter_657',['setMotionFilter',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#af63308021cfb37cf696836665d78a820',1,'cv::videostab::OnePassStabilizer']]], + ['setmotionmodel_658',['setMotionModel',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html#afa8d7b05663b5ab2f70dd24a344fac44',1,'cv::videostab::ImageMotionEstimatorBase::setMotionModel()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#ae6b922a0eac6e676f0b1574fe388645b',1,'cv::videostab::InpainterBase::setMotionModel()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a8c4c28f4607190586ab6798d8a79329a',1,'cv::videostab::InpaintingPipeline::setMotionModel()'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a39e32aad5e5befe66b1f63a4c90ca0f4',1,'cv::videostab::KeypointBasedMotionEstimator::setMotionModel()'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a518fd7f0509c5c65abf1fa3bda53b59b',1,'cv::videostab::LpMotionStabilizer::setMotionModel()'],['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html#a7ef89b8847fc28a75bf4199b8f194340',1,'cv::videostab::MotionEstimatorBase::setMotionModel()'],['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html#af1b5617fa890b67fae05e834eff08a39',1,'cv::videostab::ToFileMotionWriter::setMotionModel()']]], + ['setmotions_659',['setMotions',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#ada073eb8634a26003e1b63a784bda641',1,'cv::videostab::DeblurerBase::setMotions()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a91ea73b4944c3f852ae48dff5cc48557',1,'cv::videostab::InpainterBase::setMotions()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a20a3c9acf34d3251bfbaa9f831473c63',1,'cv::videostab::InpaintingPipeline::setMotions()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a5052a8611fcfeba174f81da6ad7b86a8',1,'cv::videostab::WobbleSuppressorBase::setMotions(const std::vector< Mat > &val)']]], + ['setmotions2_660',['setMotions2',['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#adf3da51295d954d3a5371126aced4d14',1,'cv::videostab::WobbleSuppressorBase']]], + ['setmotionstabilizer_661',['setMotionStabilizer',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#af234eec62a25308270c95f7f066e74aa',1,'cv::videostab::TwoPassStabilizer']]], + ['setmotormode_662',['setMotorMode',['../namespacecan_1_1motor.html#aa5c314d6964158f588099ae2cce5a161',1,'can::motor']]], + ['setmotorpidconstants_663',['setMotorPIDConstants',['../namespacecan_1_1motor.html#af4cac5edf238d3d3dce9cd2b32015751',1,'can::motor']]], + ['setmotorpidtarget_664',['setMotorPIDTarget',['../namespacecan_1_1motor.html#a77e1a69516ed47142f01d7e2394dc44c',1,'can::motor']]], + ['setmotorpos_665',['setMotorPos',['../classrobot_1_1base__motor.html#aec029f50295879b3750f954449af93fe',1,'robot::base_motor::setMotorPos()'],['../classrobot_1_1can__motor.html#abc7a7fef8b60196a0fe3cd4b46e4f4b1',1,'robot::can_motor::setMotorPos()'],['../classrobot_1_1sim__motor.html#a07ff50c316cc1c2bf96e4ea3d93fb0ef',1,'robot::sim_motor::setMotorPos()'],['../namespacerobot.html#a885f8a319493d7b6c2143a2414409d7a',1,'robot::setMotorPos()']]], + ['setmotorpower_666',['setMotorPower',['../classrobot_1_1base__motor.html#a50ed7e9cd52824ea7f565f3d19cf2c6d',1,'robot::base_motor::setMotorPower()'],['../classrobot_1_1can__motor.html#a8c6f8c9360ee2f37bf1a0a02d3df037f',1,'robot::can_motor::setMotorPower()'],['../classrobot_1_1sim__motor.html#a83cfa2565029955dea5fbc6c1e4d0a72',1,'robot::sim_motor::setMotorPower()'],['../namespacecan_1_1motor.html#a4b1bd661cbd859a8b6a169b2b0386e28',1,'can::motor::setMotorPower(deviceserial_t serial, double power)'],['../namespacecan_1_1motor.html#a3c251243129745f601b9c1a770ea7939',1,'can::motor::setMotorPower(deviceserial_t serial, int16_t power)'],['../namespacerobot.html#ad44ac5c5e111853330b0025450e2acc3',1,'robot::setMotorPower()']]], + ['setmotorvel_667',['setMotorVel',['../classrobot_1_1base__motor.html#a4e4f0ba9c71614508df1b713290e46ed',1,'robot::base_motor::setMotorVel()'],['../classrobot_1_1can__motor.html#abb1d04afbd630d18db9b0befe1ebd3df',1,'robot::can_motor::setMotorVel()'],['../namespacerobot.html#a724974bfa7bc871d135fee39560fc7ac',1,'robot::setMotorVel()']]], + ['setmousecallback_668',['setMouseCallback',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga89e7806b0a616f6f1d502bd8c183ad3e',1,'cv::setMouseCallback()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga89e7806b0a616f6f1d502bd8c183ad3e',1,'setMouseCallback()(Global Namespace)']]], + ['setmsgtype_669',['setMsgType',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#acceee66fe8604d9293e12b498578a41e',1,'cv::cuda::StereoBeliefPropagation']]], + ['setmultiline_670',['setMultiline',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#a9b1b38d0429011d5825cae92d0421233',1,'cv::Formatter']]], + ['setname_671',['setName',['../classcam_1_1Camera.html#a3474ed329bae10aff70af0e7f99cc51b',1,'cam::Camera']]], + ['setndummies_672',['setNDummies',['https://docs.opencv.org/4.2.0/df/d9a/classcv_1_1HistogramCostExtractor.html#a625258f2c9005af2f6745195830e5b4b',1,'cv::HistogramCostExtractor']]], + ['setneedplotline_673',['setNeedPlotLine',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a398e06229d7d7ae697863b1a299ab63d',1,'cv::plot::Plot2d']]], + ['setneighbors_674',['setNeighbors',['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html#ab225f7bf353ce8697a506eda10124a92',1,'cv::face::LBPHFaceRecognizer']]], + ['setnlevels_675',['setNLevels',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a73016bcb9692c5c3a7124f707689f667',1,'cv::ORB']]], + ['setnmixtures_676',['setNMixtures',['https://docs.opencv.org/4.2.0/d6/da7/classcv_1_1bgsegm_1_1BackgroundSubtractorMOG.html#a39b96d7ab5d7bc821c828639d2bf1594',1,'cv::bgsegm::BackgroundSubtractorMOG::setNMixtures()'],['https://docs.opencv.org/4.2.0/d1/dfe/classcv_1_1cuda_1_1BackgroundSubtractorMOG.html#a1bfab8e61c3199126a9133266147e83f',1,'cv::cuda::BackgroundSubtractorMOG::setNMixtures()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#ae049541aaa12c3a69d854c8f79a23ba3',1,'cv::BackgroundSubtractorMOG2::setNMixtures()']]], + ['setnoctavelayers_677',['setNOctaveLayers',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a45d8b1d6f4d7c1e82d5c76a5eca2a4eb',1,'cv::AKAZE::setNOctaveLayers()'],['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a2e924736db869f733e7892fdb1d9ce08',1,'cv::KAZE::setNOctaveLayers()'],['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html#acd9d6b3526a6ee7a98b2d86a03d28029',1,'cv::xfeatures2d::SURF::setNOctaveLayers()']]], + ['setnoctaves_678',['setNOctaves',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#abfd3d6fa82ea3e1301b83b07205762fe',1,'cv::AKAZE::setNOctaves()'],['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a986db4cdad6723c087f9d726bc85dc43',1,'cv::KAZE::setNOctaves()'],['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html#acc3e19253eab977a75f087151a65418e',1,'cv::xfeatures2d::SURF::setNOctaves()']]], + ['setnoisesigma_679',['setNoiseSigma',['https://docs.opencv.org/4.2.0/d6/da7/classcv_1_1bgsegm_1_1BackgroundSubtractorMOG.html#abdda60af4c063e40cf172ecd7e4f3262',1,'cv::bgsegm::BackgroundSubtractorMOG::setNoiseSigma()'],['https://docs.opencv.org/4.2.0/d1/dfe/classcv_1_1cuda_1_1BackgroundSubtractorMOG.html#a4c554b9f5e0264967a77a176488f8f14',1,'cv::cuda::BackgroundSubtractorMOG::setNoiseSigma()']]], + ['setnonmaxsuppression_680',['setNonMaxSuppression',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a916b81db081cc0102b595c8ffbd6d0c2',1,'cv::text::ERFilter']]], + ['setnonmaxsuppression_681',['setNonmaxSuppression',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#af61c25a92bed9fa6f6dcb8fdfdc2bc3c',1,'cv::AgastFeatureDetector::setNonmaxSuppression()'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a02ccd890c6ec44781efb05f36ec524e3',1,'cv::FastFeatureDetector::setNonmaxSuppression()']]], + ['setnormalarray_682',['setNormalArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a99ea6c9483ac94e8fb6588d94c6c4e1c',1,'cv::ogl::Arrays']]], + ['setnormflag_683',['setNormFlag',['https://docs.opencv.org/4.2.0/d0/d1c/classcv_1_1EMDHistogramCostExtractor.html#aea93ed360dbb425c0d590da0abc65d47',1,'cv::EMDHistogramCostExtractor::setNormFlag()'],['https://docs.opencv.org/4.2.0/df/d65/classcv_1_1NormHistogramCostExtractor.html#aca8175822047996563fe7892945848b7',1,'cv::NormHistogramCostExtractor::setNormFlag()']]], + ['setnormsigma0_684',['setNormSigma0',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#acda8f7bb5e3684bee7aef16bbb49345c',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['setnormsigma1_685',['setNormSigma1',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#aadad73ad59c63569b65bf3e8dbcb4a4d',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['setnrfeeds_686',['setNrFeeds',['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a2764dddb47b321b5c66b33b28f4e8571',1,'cv::detail::BlocksCompensator::setNrFeeds()'],['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html#a0e88972a7011b2a112e4fe20346d4f35',1,'cv::detail::ChannelsCompensator::setNrFeeds()'],['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#aa1b612c1f334592c084cdf057ce15805',1,'cv::detail::GainCompensator::setNrFeeds()']]], + ['setnrgainsfilteringiterations_687',['setNrGainsFilteringIterations',['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a96056be42faacbbc90c88d1a933f732c',1,'cv::detail::BlocksCompensator']]], + ['setnrplane_688',['setNrPlane',['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1cuda_1_1StereoConstantSpaceBP.html#abedc3ed02f0c19eeed836d07317b30a5',1,'cv::cuda::StereoConstantSpaceBP']]], + ['setnsamples_689',['setNSamples',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#aff347ac596a90bb3db2ceb91f19b5d87',1,'cv::BackgroundSubtractorKNN']]], + ['setnss_690',['setNSS',['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#aa33805361ab88495430ae21f5e779027',1,'cv::saliency::ObjectnessBING']]], + ['setnu_691',['setNu',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aa19ae35bcf07f52a4009ceeca583b113',1,'cv::ml::SVM']]], + ['setnull_692',['setNull',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a2399d72bf7dbd9f3589c69f32cbec306',1,'Eigen::AlignedBox']]], + ['setnumbands_693',['setNumBands',['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html#a2efd19181426ba017b23c24c88666188',1,'cv::detail::MultiBandBlender']]], + ['setnumclassifierrootnodes_694',['setNumClassifierRootNodes',['https://docs.opencv.org/4.2.0/d5/d37/structHaarStage64.html#a6d3532ce82316f4a0e7f4568638c4bba',1,'HaarStage64']]], + ['setnumcomponents_695',['setNumComponents',['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html#a8c7225de7d5ac05f6442abb8e88aac95',1,'cv::face::BasicFaceRecognizer']]], + ['setnumdisparities_696',['setNumDisparities',['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#a9d9082be76523c5f11fe6d21dce0afcc',1,'cv::cuda::DisparityBilateralFilter::setNumDisparities()'],['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#abacfe4e5760e86b48d0c19bd4106c2fc',1,'cv::StereoMatcher::setNumDisparities()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#af1b3153c4ad52991ffb45574f44fbf1a',1,'cv::stereo::StereoMatcher::setNumDisparities()']]], + ['setnumframes_697',['setNumFrames',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a83a88db22c8432215b3f9f2afe450efc',1,'cv::bgsegm::BackgroundSubtractorGMG::setNumFrames()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a3d33de36df6a96108b4d68ef1274081f',1,'cv::cuda::BackgroundSubtractorGMG::setNumFrames()']]], + ['setnumiterations_698',['setNumIterations',['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#ad30156f4e11110edc9601bf4768945ca',1,'cv::cuda::OpticalFlowDual_TVL1']]], + ['setnumiters_699',['setNumIters',['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1cuda_1_1DensePyrLKOpticalFlow.html#af4d64eff51c14f3c5f5ae9b25adf168c',1,'cv::cuda::DensePyrLKOpticalFlow::setNumIters()'],['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#afed083f8d80af4d4e67a4e21fb5841be',1,'cv::cuda::DisparityBilateralFilter::setNumIters()'],['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#aa3a3accde9da8c1d2ee7f3dc2697c059',1,'cv::FarnebackOpticalFlow::setNumIters()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#ace94e34039f31487a7f408f721ecf027',1,'cv::cuda::FarnebackOpticalFlow::setNumIters()'],['https://docs.opencv.org/4.2.0/d7/d05/classcv_1_1cuda_1_1SparsePyrLKOpticalFlow.html#af2d224ec011620f797b6e9c39b8e7368',1,'cv::cuda::SparsePyrLKOpticalFlow::setNumIters()'],['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#a600d2701f37f1247e1cba922c11eb827',1,'cv::cuda::StereoBeliefPropagation::setNumIters()']]], + ['setnumlevels_700',['setNumLevels',['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#a19152daa38e2f224da52ad15362360fa',1,'cv::FarnebackOpticalFlow::setNumLevels()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#aef2b85c540d247e2118709a23e251910',1,'cv::cuda::FarnebackOpticalFlow::setNumLevels()'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a7602088f3e792de196f8f7efcd9bd448',1,'cv::cuda::HOG::setNumLevels()'],['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#ac346c8b7f7f2e200e8874c3399bf1000',1,'cv::cuda::StereoBeliefPropagation::setNumLevels()']]], + ['setnumofangleline_701',['setNumOfAngleLine',['https://docs.opencv.org/4.2.0/d5/d97/classcv_1_1img__hash_1_1RadialVarianceHash.html#a177638c49d134ca7f0e5624b30c8bff6',1,'cv::img_hash::RadialVarianceHash']]], + ['setnumofoctaves_702',['setNumOfOctaves',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a5afb3050826b37027ca399e2e2308426',1,'cv::line_descriptor::BinaryDescriptor']]], + ['setnumscales_703',['setNumScales',['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#ad5e5e4fb4c6ab96e520cce317ec19da1',1,'cv::cuda::OpticalFlowDual_TVL1']]], + ['setnumsliciter_704',['setNumSlicIter',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#a15637f86ecbd5ef2e944810e75fbdaa8',1,'cv::hfs::HfsSegment']]], + ['setnumthreads_705',['setNumThreads',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae78625c3c2aa9e0b83ed31b73c6549c0',1,'cv::setNumThreads()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae78625c3c2aa9e0b83ed31b73c6549c0',1,'setNumThreads()(Global Namespace)']]], + ['setnumwarps_706',['setNumWarps',['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#a970b9e7ca756cc36ac706ebebf5995f0',1,'cv::cuda::OpticalFlowDual_TVL1']]], + ['setoctaves_707',['setOctaves',['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html#a589cbebff16f09783a1a902621efa7c1',1,'cv::BRISK']]], + ['setoffscreenrendering_708',['setOffScreenRendering',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a4d84fda69cb20ba20a77a1ae9d791610',1,'cv::viz::Viz3d']]], + ['setomega_709',['setOmega',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#a26008e93f8992623d405981ff2f47234',1,'cv::VariationalRefinement']]], + ['setones_710',['setOnes',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a250ef1b827e748f3f898fb2e55cb96e2',1,'Eigen::DenseBase::setOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a250ef1b827e748f3f898fb2e55cb96e2',1,'DenseBase< ArrayWrapper< ExpressionType > >::setOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a250ef1b827e748f3f898fb2e55cb96e2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::setOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a250ef1b827e748f3f898fb2e55cb96e2',1,'DenseBase< Solve< Decomposition, RhsType > >::setOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'Eigen::PlainObjectBase::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'Eigen::PlainObjectBase::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'Eigen::PlainObjectBase::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'Eigen::PlainObjectBase::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8700dc6d8e05436c0b34ae15ca9274a5',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad06b9d8ddac261a871c9ff550a925975',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a3bd80eb3e6779ba362628b1cb62a665e',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ab04727b1a70e7d0b5ce9d004b3349075',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setOnes(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a4e6b3b2af8d0d6d06d14ec3c7092cffc',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::setOnes()']]], + ['setopenglcontext_711',['setOpenGlContext',['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html#ga1168ad91e634e3e34e2295a3ba9a6244',1,'cv::setOpenGlContext()'],['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html#ga1168ad91e634e3e34e2295a3ba9a6244',1,'setOpenGlContext()(Global Namespace)']]], + ['setopengldrawcallback_712',['setOpenGlDrawCallback',['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html#gaf80dcbc168a6ce40f6d1ad9d79a10bb8',1,'cv::setOpenGlDrawCallback()'],['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html#gaf80dcbc168a6ce40f6d1ad9d79a10bb8',1,'setOpenGlDrawCallback()(Global Namespace)']]], + ['setoptflowestimator_713',['setOptFlowEstimator',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#ab6613bb5eccf19f8cc13154ea8af39af',1,'cv::videostab::MotionInpainter']]], + ['setopticalflow_714',['setOpticalFlow',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ae24dac3128c6a5e9c2cc6cb3c7187757',1,'cv::superres::SuperResolution']]], + ['setopticalflowestimator_715',['setOpticalFlowEstimator',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a8ad21523860d819b2a84faeace4551c4',1,'cv::videostab::KeypointBasedMotionEstimator']]], + ['setoptimalparameters_716',['setOptimalParameters',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#ac9ead52ddcce2953c61335185de4178c',1,'cv::ml::SVMSGD']]], + ['setouteriterations_717',['setOuterIterations',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#a8fca0669fbe319e749fb55e360b0a015',1,'cv::cuda::BroxOpticalFlow::setOuterIterations()'],['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html#a77779ee478a3c6e05b7d4ce4ffe99c56',1,'cv::superres::BroxOpticalFlow::setOuterIterations()'],['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#af08c018bd0996abf910a7ce346c9ae7e',1,'cv::optflow::DualTVL1OpticalFlow::setOuterIterations()']]], + ['setouterradius_718',['setOuterRadius',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#abe0a9db459ed820ceb884cdb95712c12',1,'cv::ShapeContextDistanceExtractor']]], + ['setoutlierrejector_719',['setOutlierRejector',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#ade0c45a14e83a4f2b7a480f4459c47b9',1,'cv::videostab::KeypointBasedMotionEstimator']]], + ['setoutputfuncjacobianv_720',['setOutputFuncJacobianV',['../classfilters_1_1Output.html#a777261c2c893f5e02b2a11a400a7bafd',1,'filters::Output']]], + ['setoutputfuncjacobianx_721',['setOutputFuncJacobianX',['../classfilters_1_1Output.html#a78bbff2cb72b757d3d2443fcb5ecb718',1,'filters::Output']]], + ['setoutputmax_722',['setOutputMax',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a06962b042d9089366bc6347e608481b6',1,'cv::xphoto::SimpleWB']]], + ['setoutputmin_723',['setOutputMin',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a60d1e06b122747d416c4f1563167c740',1,'cv::xphoto::SimpleWB']]], + ['setoutshape_724',['setOutShape',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a10ea7f293d12413b4a897ddc6a8714ff',1,'cv::dnn::LSTMLayer']]], + ['setp_725',['setP',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a31b6bb5452afdb5a444920013417f018',1,'cv::xphoto::SimpleWB::setP()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aed346ecd8b15379717053254ae067d96',1,'cv::ml::SVM::setP()']]], ['setp_726',['setp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'__gnu_cxx::enc_filebuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'__gnu_cxx::stdio_filebuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'__gnu_cxx::stdio_sync_filebuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_filebuf< char_type, traits_type >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_streambuf< _Elem, _Tr >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_streambuf< char, _Traits >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_streambuf< char, char_traits< char > >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'std::basic_filebuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'std::basic_streambuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'std::basic_stringbuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'std::wbuffer_convert::setp()']]], - ['setp_727',['setP',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a31b6bb5452afdb5a444920013417f018',1,'cv::xphoto::SimpleWB::setP()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aed346ecd8b15379717053254ae067d96',1,'cv::ml::SVM::setP()']]], - ['setp1_728',['setP1',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#ac5d2e5751dbfac3ed5bad4f1bc399c8f',1,'cv::stereo::StereoBinarySGBM::setP1()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ae62e17715deea97b431d328869a3eace',1,'cv::StereoSGBM::setP1()']]], - ['setp2_729',['setP2',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a11153c7094ae6e51c1073300f246672d',1,'cv::stereo::StereoBinarySGBM::setP2()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#a13a55a4704c988fa60e5f5902c4abfaa',1,'cv::StereoSGBM::setP2()']]], - ['setpanoconfidencethresh_730',['setPanoConfidenceThresh',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a6f5e62bc1dd5d7bdb5f9313a2c21c558',1,'cv::Stitcher']]], - ['setparam_731',['setParam',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#ab9e38d28672d35a8b59f7bffc2435400',1,'cv::dnn::Net']]], - ['setparameters_732',['setParameters',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a9d662e7707bc6d8fcc8e6cf687ec273a',1,'cv::DetectionBasedTracker']]], - ['setparams_733',['setParams',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1videostab_1_1GaussianMotionFilter.html#ab2d1ae14117e4368a949ccb247de0191',1,'cv::videostab::GaussianMotionFilter::setParams()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#ad85a6ee776c868979a087796d9b20576',1,'cv::tbm::ITrackerByMatching::setParams()']]], - ['setparamsfrom_734',['setParamsFrom',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#ad1bf1e5d77da2f75ea241e588c906177',1,'cv::dnn::Layer']]], - ['setpass2only_735',['setPass2Only',['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#aba564613ffdcd6a89ef0e381c4b02c48',1,'cv::MSER']]], - ['setpatchsize_736',['setPatchSize',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a644e7921b304c083ed93fcc199feb372',1,'cv::DISOpticalFlow::setPatchSize()'],['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a82b1719d6b194c37544675ffe48b093b',1,'cv::ORB::setPatchSize()']]], - ['setpatchstride_737',['setPatchStride',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a70fb84e13b487b3577e4ea3401839f23',1,'cv::DISOpticalFlow']]], - ['setpcaiterations_738',['setPCAIterations',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#adfe90881dab6a7f4d97d1def0ff1a829',1,'cv::ximgproc::AdaptiveManifoldFilter']]], - ['setperiod_739',['setPeriod',['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html#a7b31ec03811a5ec21a90604abcb7c2da',1,'cv::videostab::MoreAccurateMotionWobbleSuppressorBase']]], - ['setpivotthreshold_740',['setPivotThreshold',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#ac5aea9a81a8a567d32546b9d73af7fd4',1,'Eigen::SparseLU::setPivotThreshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a51206691317b0111955a71de3e76b814',1,'Eigen::SparseQR::setPivotThreshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#afd88c7631cf384fd5703bae4efacce3a',1,'Eigen::SPQR::setPivotThreshold()']]], - ['setplotaxiscolor_741',['setPlotAxisColor',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a6046c9d8b1e3ba7c4082cc7a7d052a5a',1,'cv::plot::Plot2d']]], - ['setplotbackgroundcolor_742',['setPlotBackgroundColor',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#af97ef3cc6652d466b5b18d4cd9f996e4',1,'cv::plot::Plot2d']]], - ['setplotgridcolor_743',['setPlotGridColor',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a3f86119235752f89f433c61570c8571f',1,'cv::plot::Plot2d']]], - ['setplotlinecolor_744',['setPlotLineColor',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#aca8001fc3ad93a6732f720e866864ee3',1,'cv::plot::Plot2d']]], - ['setplotlinewidth_745',['setPlotLineWidth',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a6ffabb76fae9da7a474412d13b3bb2fa',1,'cv::plot::Plot2d']]], - ['setplotsize_746',['setPlotSize',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a3d87ec313e06515e60b1d5cf96649978',1,'cv::plot::Plot2d']]], - ['setplottextcolor_747',['setPlotTextColor',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a6ba322fb5ed76865690cd58e35a9e436',1,'cv::plot::Plot2d']]], - ['setpointidxtoprint_748',['setPointIdxToPrint',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#ad2343ee63ec802f4526da6d21c06ac2b',1,'cv::plot::Plot2d']]], - ['setpolyn_749',['setPolyN',['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#a408c4f0d5b694dc815282b651a69d400',1,'cv::FarnebackOpticalFlow::setPolyN()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#a7052a5c87e886575630bb115e5bd2fa0',1,'cv::cuda::FarnebackOpticalFlow::setPolyN()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#abab8e4a57bbce5e223d626dbd6d96dba',1,'cv::superres::FarnebackOpticalFlow::setPolyN()']]], - ['setpolysigma_750',['setPolySigma',['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#a6aa97f512e1d8712480af3e8d89004a3',1,'cv::FarnebackOpticalFlow::setPolySigma()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#a2929e16965835a94c31c6836aa7c0688',1,'cv::cuda::FarnebackOpticalFlow::setPolySigma()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#a6e7e09bfb8c67413c8fc1a96ae270646',1,'cv::superres::FarnebackOpticalFlow::setPolySigma()']]], - ['setpose_751',['setPose',['https://docs.opencv.org/4.2.0/d9/d26/classcv_1_1viz_1_1Widget3D.html#a19f8b98423912d86deb35ded2cd62cca',1,'cv::viz::Widget3D']]], - ['setposthresh_752',['setPosThresh',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#af68ca3abf30a5d95b4f804806f2a3759',1,'cv::GeneralizedHoughGuil']]], - ['setprecision_753',['setprecision',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6e333ca9789cfa8a1f337434cee91957',1,'std']]], - ['setpreferablebackend_754',['setPreferableBackend',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a7f767df11386d39374db49cd8df8f59e',1,'cv::dnn::Net']]], - ['setpreferabletarget_755',['setPreferableTarget',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a9dddbefbc7f3defbe3eeb5dc3d3483f4',1,'cv::dnn::Net']]], - ['setprefiltercap_756',['setPreFilterCap',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a9bbfbab96761879a27f8f887afaf002a',1,'cv::stereo::StereoBinaryBM::setPreFilterCap()'],['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a1f04b0db5a5e2c5d21c49bf30d09e181',1,'cv::stereo::StereoBinarySGBM::setPreFilterCap()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#a19c6de399420337984db65aec28fc6b3',1,'cv::StereoBM::setPreFilterCap()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#a03019cccd79bcc833dd2423c55654975',1,'cv::StereoSGBM::setPreFilterCap()']]], - ['setprefiltersize_757',['setPreFilterSize',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#abba7b99050d33ad604c3b1a8d19f5de2',1,'cv::stereo::StereoBinaryBM::setPreFilterSize()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#a6edbcfd1dd79c9ba0c76a206741b4719',1,'cv::StereoBM::setPreFilterSize()']]], - ['setprefiltertype_758',['setPreFilterType',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a68e34fb48a39e3e3166a109899890e66',1,'cv::stereo::StereoBinaryBM::setPreFilterType()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#ae44e1b05ac1b36917cd5fb4d4fd1d7c2',1,'cv::StereoBM::setPreFilterType()']]], - ['setpriors_759',['setPriors',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a66756433f31db77a5511fc3f85403bd9',1,'cv::ml::DTrees']]], - ['setproducecelloutput_760',['setProduceCellOutput',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a593731630bfc7951471941018399cdb4',1,'cv::dnn::LSTMLayer']]], - ['setproducehiddenoutput_761',['setProduceHiddenOutput',['https://docs.opencv.org/4.2.0/dd/dfd/classcv_1_1dnn_1_1RNNLayer.html#a9f2270d30bb34a13b1c2c83aa16c3496',1,'cv::dnn::RNNLayer']]], - ['setprop_762',['setProp',['https://docs.opencv.org/4.2.0/dd/d02/structcv_1_1viz_1_1WidgetAccessor.html#acd4eaa43e67c2b55ec36a60e066fd8cb',1,'cv::viz::WidgetAccessor']]], - ['setpyramidscalefactor_763',['setPyramidScaleFactor',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#a9019efb36e28f9ea2ce420b1efcd010e',1,'cv::cuda::BroxOpticalFlow']]], - ['setpyrscale_764',['setPyrScale',['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#a3e9149ec5a74942b81959c198a13f1b3',1,'cv::FarnebackOpticalFlow::setPyrScale()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#a5421e1b742044a391972c1ccfa3a0896',1,'cv::cuda::FarnebackOpticalFlow::setPyrScale()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#a28a50b9759ce34e4a3cec42cd1460241',1,'cv::superres::FarnebackOpticalFlow::setPyrScale()']]], - ['setqualitylevel_765',['setQualityLevel',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#a55cb5f40d65ad96483f4d5667f932ec1',1,'cv::GFTTDetector']]], - ['setquantizationlevels_766',['setQuantizationLevels',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#abfbfb841e57ea94ccc189e10ca31051f',1,'cv::bgsegm::BackgroundSubtractorGMG::setQuantizationLevels()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a821679db06489d0ee8efe92a4716d89b',1,'cv::cuda::BackgroundSubtractorGMG::setQuantizationLevels()']]], - ['setradialbins_767',['setRadialBins',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a601bedc2ff38e281f6bcc34d7d59c0fa',1,'cv::ShapeContextDistanceExtractor']]], - ['setradius_768',['setRadius',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#aff114dc78cdafd537d14879de31ef16e',1,'cv::videostab::DeblurerBase::setRadius()'],['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#a969b637e1b400b21997537a8d55ec61a',1,'cv::cuda::DisparityBilateralFilter::setRadius()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#ae2bfdae38decac0507ae942294b686b8',1,'cv::videostab::InpainterBase::setRadius()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a5b13150e97832acd181c5f48b4dd536f',1,'cv::videostab::InpaintingPipeline::setRadius()'],['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html#a62d94c75cade902fd3b487b1ef9883fc',1,'cv::face::LBPHFaceRecognizer::setRadius()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a0245ba9e08329f9ac2f617a8f7c1eaaf',1,'cv::videostab::StabilizerBase::setRadius()']]], - ['setrandom_769',['setRandom',['https://docs.opencv.org/4.2.0/da/d27/classcv_1_1CalibrateDebevec.html#a9868cb53e5db7be83d7aed5220738643',1,'cv::CalibrateDebevec::setRandom()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac476e5852129ba32beaa1a8a3d7ee0db',1,'Eigen::DenseBase::setRandom()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac476e5852129ba32beaa1a8a3d7ee0db',1,'DenseBase< ArrayWrapper< ExpressionType > >::setRandom()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac476e5852129ba32beaa1a8a3d7ee0db',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::setRandom()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac476e5852129ba32beaa1a8a3d7ee0db',1,'DenseBase< Solve< Decomposition, RhsType > >::setRandom()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'Eigen::PlainObjectBase::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'Eigen::PlainObjectBase::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'Eigen::PlainObjectBase::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'Eigen::PlainObjectBase::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)']]], - ['setrangemaxval_770',['setRangeMaxVal',['https://docs.opencv.org/4.2.0/d4/d3b/classcv_1_1xphoto_1_1LearningBasedWB.html#a3d9395274be8053b2f09e46d11a24a65',1,'cv::xphoto::LearningBasedWB']]], - ['setrankproportion_771',['setRankProportion',['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1HausdorffDistanceExtractor.html#a36af13e0653ebb2d6677e68932010dfb',1,'cv::HausdorffDistanceExtractor']]], - ['setransacparams_772',['setRansacParams',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#a8926e08d617764a6e73250c2e4f8caaa',1,'cv::videostab::MotionEstimatorRansacL2::setRansacParams()'],['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a8fd42e55f57a3294ff6545c683e25e16',1,'cv::videostab::TranslationBasedLocalOutlierRejector::setRansacParams()']]], - ['setreconstructionoptions_773',['setReconstructionOptions',['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html#a25e8af5b84c3686ba329311e43600ae9',1,'cv::sfm::BaseSFM::setReconstructionOptions()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#a08cf4ba6ffcfcc78bf1f5b3006154172',1,'cv::sfm::SFMLibmvEuclideanReconstruction::setReconstructionOptions()']]], - ['setrect_774',['setRect',['https://docs.opencv.org/4.2.0/d1/d74/structHaarFeature64.html#a9881c5a424318d3e19570b464ac63659',1,'HaarFeature64']]], - ['setreductionratio_775',['setReductionRatio',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a91dfdf7c607b60f6ff27c4df1dc51f0e',1,'cv::line_descriptor::BinaryDescriptor']]], - ['setrefinementmask_776',['setRefinementMask',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#aa47bf2d3496b65b3e70b5b43681e5360',1,'cv::detail::BundleAdjusterBase']]], - ['setrefinemodels_777',['setRefineModels',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a38ecbadcbe486dc2fad2d2e2d3dc64b4',1,'cv::ximgproc::RICInterpolator']]], - ['setregistrationresol_778',['setRegistrationResol',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a9912fe8c095b8385267908e5ef707439',1,'cv::Stitcher']]], - ['setregressionaccuracy_779',['setRegressionAccuracy',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a936a3b56ccc5684f279dfd76bbea0247',1,'cv::ml::DTrees']]], - ['setregularization_780',['setRegularization',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#abfe3f52c9e90a631b37baba63af21a49',1,'cv::ml::LogisticRegression']]], - ['setregularizationparameter_781',['setRegularizationParameter',['https://docs.opencv.org/4.2.0/dc/d18/classcv_1_1ThinPlateSplineShapeTransformer.html#ae163bbf29cafb9aa52c5e1cafdb7f4da',1,'cv::ThinPlateSplineShapeTransformer']]], - ['setrenderingproperty_782',['setRenderingProperty',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#af340fbe5b89aa3be57beb9fed91540a8',1,'cv::viz::Viz3d::setRenderingProperty()'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#af93f4866a4ceb8c3cdf6ab70bd5521ee',1,'cv::viz::Widget::setRenderingProperty()']]], - ['setrepresentation_783',['setRepresentation',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a0d42eeb4f71caa47ab2afbae5e5f496e',1,'cv::viz::Viz3d']]], - ['setrho_784',['setRho',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#a7c28b483669bf7286ac9356e36f78c1d',1,'cv::cuda::HoughLinesDetector::setRho()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html#ac3241f0ceb27843e66b060e79d98898c',1,'cv::cuda::HoughSegmentDetector::setRho()']]], - ['setricslictype_785',['setRICSLICType',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#aed741aab275fb1c2711108f33e526e64',1,'cv::optflow::DenseRLOFOpticalFlow']]], - ['setricspsize_786',['setRICSPSize',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#afc76edbc281509a88ad9f80e04f8ace8',1,'cv::optflow::DenseRLOFOpticalFlow']]], - ['setrightnodedesc_787',['setRightNodeDesc',['https://docs.opencv.org/4.2.0/de/db5/structHaarClassifierNode128.html#a86df27b22f7ed8f1f0158667344b4a7c',1,'HaarClassifierNode128']]], - ['setrlofopticalflowparameter_788',['setRLOFOpticalFlowParameter',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a2444cb65d35a640eb28f8978652b2342',1,'cv::optflow::DenseRLOFOpticalFlow::setRLOFOpticalFlowParameter()'],['https://docs.opencv.org/4.2.0/df/dc4/classcv_1_1optflow_1_1SparseRLOFOpticalFlow.html#ae438345e3d2b55f30301f0057356a03d',1,'cv::optflow::SparseRLOFOpticalFlow::setRLOFOpticalFlowParameter()']]], - ['setrngseed_789',['setRNGSeed',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga757e657c037410d9e19e819569e7de0f',1,'cv::setRNGSeed()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga757e657c037410d9e19e819569e7de0f',1,'setRNGSeed()(Global Namespace)']]], - ['setroi1_790',['setROI1',['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#a4bc3beb14fb5db0d58533fa101de20a2',1,'cv::StereoBM']]], - ['setroi2_791',['setROI2',['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#ae4b5129722296e505bfba9fac46d43a2',1,'cv::StereoBM']]], - ['setrotationinvariant_792',['setRotationInvariant',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#aac3054da68894dbbac9ed6801eb50d32',1,'cv::ShapeContextDistanceExtractor']]], - ['setrows_793',['setRows',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a775e26ae9b7366049163df909b4fb064',1,'cv::rgbd::RgbdNormals']]], - ['setrpropdw0_794',['setRpropDW0',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ae32498b59f9b8ce5737006ad49ad863e',1,'cv::ml::ANN_MLP']]], - ['setrpropdwmax_795',['setRpropDWMax',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a09d58b45d950729587577de3a7ed7142',1,'cv::ml::ANN_MLP']]], - ['setrpropdwmin_796',['setRpropDWMin',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a2d1c40a8eae6c7ad25554593a11d1e80',1,'cv::ml::ANN_MLP']]], - ['setrpropdwminus_797',['setRpropDWMinus',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a65350ee4fbb0e521e3d53dbd3101dadd',1,'cv::ml::ANN_MLP']]], - ['setrpropdwplus_798',['setRpropDWPlus',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a54b72c0446330effe6a003929d4aecbe',1,'cv::ml::ANN_MLP']]], - ['setsampleroi_799',['setSampleROI',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a154e3dd2a6584f00107f9f314302a822',1,'cv::TrackerStateEstimatorAdaBoosting']]], - ['setsamples_800',['setSamples',['https://docs.opencv.org/4.2.0/da/d27/classcv_1_1CalibrateDebevec.html#a2296f94b849dd9abe06ef285e446d439',1,'cv::CalibrateDebevec']]], - ['setsamplingpoints_801',['setSamplingPoints',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a04adf50e23489c41975a6b7524c189d4',1,'cv::xfeatures2d::PCTSignatures']]], - ['setsaturation_802',['setSaturation',['https://docs.opencv.org/4.2.0/da/d53/classcv_1_1TonemapDrago.html#aac3b1ea8fb3d8c4bf14786c57e73ba78',1,'cv::TonemapDrago::setSaturation()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga9c7de9517f95fd046910fc818e256d55',1,'cv::xphoto::TonemapDurand::setSaturation()'],['https://docs.opencv.org/4.2.0/de/d76/classcv_1_1TonemapMantiuk.html#a9313da874ede9561f23013d3dacc5292',1,'cv::TonemapMantiuk::setSaturation()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga9c7de9517f95fd046910fc818e256d55',1,'setSaturation()(Global Namespace)']]], - ['setsaturationthreshold_803',['setSaturationThreshold',['https://docs.opencv.org/4.2.0/d7/d71/classcv_1_1xphoto_1_1GrayworldWB.html#ac6e17766e394adc15588b8522202cc71',1,'cv::xphoto::GrayworldWB::setSaturationThreshold()'],['https://docs.opencv.org/4.2.0/d4/d3b/classcv_1_1xphoto_1_1LearningBasedWB.html#a9bff5a507d4dffc58e16d85b1d07f35f',1,'cv::xphoto::LearningBasedWB::setSaturationThreshold()']]], - ['setsaturationweight_804',['setSaturationWeight',['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html#a5b0db42a20974ec512a7722e8fa6c92a',1,'cv::MergeMertens']]], - ['setscale_805',['setScale',['https://docs.opencv.org/4.2.0/d5/d76/classcv_1_1PyRotationWarper.html#a90b000bb75f95294f9b0b6ec9859eb55',1,'cv::PyRotationWarper::setScale()'],['https://docs.opencv.org/4.2.0/da/db8/classcv_1_1detail_1_1RotationWarper.html#a04686ebbe20736e23702e43ec0acf074',1,'cv::detail::RotationWarper::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'cv::detail::RotationWarperBase::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< CompressedRectilinearPortraitProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< CompressedRectilinearProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< CylindricalPortraitProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< CylindricalProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< FisheyeProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< MercatorProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< PaniniPortraitProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< PaniniProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< PlanePortraitProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< PlaneProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< SphericalPortraitProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< SphericalProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< StereographicProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< TransverseMercatorProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a00f559b0f66b86a44de84a08527919c2',1,'cv::superres::SuperResolution::setScale()'],['https://docs.opencv.org/4.2.0/de/d76/classcv_1_1TonemapMantiuk.html#a5b4522c68f77cd622e75c32ff52fc637',1,'cv::TonemapMantiuk::setScale()']]], - ['setscalefactor_806',['setScaleFactor',['https://docs.opencv.org/4.2.0/d1/dfd/classcv_1_1xfeatures2d_1_1BoostDesc.html#aafc23cbcf6ad22396ea49e776288577e',1,'cv::xfeatures2d::BoostDesc::setScaleFactor()'],['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html#a26e9db5400a767bee098cfaf518e15f3',1,'cv::superres::BroxOpticalFlow::setScaleFactor()'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a0900d85125de1fa488c883e56547e351',1,'cv::cuda::CascadeClassifier::setScaleFactor()'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a21dc5e3dc6272030694d52e83352b337',1,'cv::cuda::HOG::setScaleFactor()'],['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#a9f11f963c44fb96531595cbbca220730',1,'cv::DetectionBasedTracker::IDetector::setScaleFactor()'],['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a9d7bd07408d3a5cd884ccff61df01092',1,'cv::ORB::setScaleFactor()'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html#aac2721395d08d43418bf4459e2222878',1,'cv::xfeatures2d::VGG::setScaleFactor()']]], - ['setscalesnumber_807',['setScalesNumber',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a1cb192031548638c254e086bc7d6e896',1,'cv::optflow::DualTVL1OpticalFlow::setScalesNumber()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#a44f95554a5a05f2b413320fbfc4d0810',1,'cv::superres::DualTVL1OpticalFlow::setScalesNumber()']]], - ['setscalestep_808',['setScaleStep',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#acec9624d8c84ec6408f8c389c4db5c8c',1,'cv::optflow::DualTVL1OpticalFlow::setScaleStep()'],['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a745e781d3341b320e1b23504482cd3ae',1,'cv::GeneralizedHoughGuil::setScaleStep()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#ad9a69e01db9833117a50365976b2f803',1,'cv::cuda::OpticalFlowDual_TVL1::setScaleStep()']]], - ['setscalethresh_809',['setScaleThresh',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a25fb2540b6ac5383c33fad5c3677eaeb',1,'cv::GeneralizedHoughGuil']]], - ['setscallefactor_810',['setScalleFactor',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a20d9b0120ffa97f780f7b580fd623df2',1,'cv::stereo::StereoBinaryBM']]], - ['setscallingfactor_811',['setScallingFactor',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#ad8f2f8256df95438f8d0f77aafc8e122',1,'cv::stereo::Matching']]], - ['setscoretype_812',['setScoreType',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a9ab0540195ab49f9e58db065bf38e783',1,'cv::ORB']]], - ['setseamestimationresol_813',['setSeamEstimationResol',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad0fcef52b2fedda1dbb90ea780cd7979',1,'cv::Stitcher']]], - ['setseamfinder_814',['setSeamFinder',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad813cf8a3493fa6fe53343f3f5a1da81',1,'cv::Stitcher']]], - ['setsearchparams_815',['setSearchParams',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#ad6ee0fb868c7b97bb967f0ccb7ed1e1b',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['setsegegbthresholdi_816',['setSegEgbThresholdI',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#a0eff2a2f17a1262f6b9f3271695f071b',1,'cv::hfs::HfsSegment']]], - ['setsegegbthresholdii_817',['setSegEgbThresholdII',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#aa0ea696e91819ee3706f8353b07d5cb0',1,'cv::hfs::HfsSegment']]], - ['setsensitivity_818',['setSensitivity',['https://docs.opencv.org/4.2.0/df/d5b/classcv_1_1videostab_1_1WeightingDeblurer.html#ac928392260915d897cc26ea0d1f590b3',1,'cv::videostab::WeightingDeblurer']]], - ['setsensorerrora_819',['setSensorErrorA',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a1e18620cab2408fb23c611675bd5e3a1',1,'cv::rgbd::RgbdPlane']]], - ['setsensorerrorb_820',['setSensorErrorB',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a75a7438acda400bab1cb94116b9d1b55',1,'cv::rgbd::RgbdPlane']]], - ['setsensorerrorc_821',['setSensorErrorC',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a13d9895015125131e4e76c717228d657',1,'cv::rgbd::RgbdPlane']]], - ['setservopos_822',['setServoPos',['../namespacecan_1_1motor.html#af3d8be6908d1f8cf8e961face650b1d8',1,'can::motor']]], - ['setshadowthreshold_823',['setShadowThreshold',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#a85efc41f5e3e7f7ca2c92245829043c0',1,'cv::BackgroundSubtractorKNN::setShadowThreshold()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a1e9f50c4bf60b77ca12a6977ccdd08cb',1,'cv::BackgroundSubtractorMOG2::setShadowThreshold()']]], - ['setshadowvalue_824',['setShadowValue',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#a5a4d993edba38be565198098bcc40004',1,'cv::BackgroundSubtractorKNN::setShadowValue()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a259029f0eefe5ade47d98d744e829f8a',1,'cv::BackgroundSubtractorMOG2::setShadowValue()']]], - ['setshapecontextweight_825',['setShapeContextWeight',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#ac9ea3a1ce4a9e8767acef0a48a7cf8d6',1,'cv::ShapeContextDistanceExtractor']]], - ['setsharpness_826',['setSharpness',['https://docs.opencv.org/4.2.0/d4/d69/classcv_1_1detail_1_1FeatherBlender.html#aa4c09de778a01cdad7af1aabc443b279',1,'cv::detail::FeatherBlender']]], - ['setshift_827',['setShift',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a886fc102723ca7bde4ac7162dfd72f5d',1,'Eigen::CholmodBase::setShift()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a886fc102723ca7bde4ac7162dfd72f5d',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::setShift()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a886fc102723ca7bde4ac7162dfd72f5d',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::setShift()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a886fc102723ca7bde4ac7162dfd72f5d',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::setShift()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a886fc102723ca7bde4ac7162dfd72f5d',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::setShift()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#a2d8d996ce1085fd977850988735739f0',1,'Eigen::HouseholderSequence::setShift()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html#a362352f755101faaac59c1ed9d5e3559',1,'Eigen::SimplicialCholeskyBase::setShift()']]], - ['setshowgrid_828',['setShowGrid',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a28f5f0df1cce34ee6a0b284d7d3f918f',1,'cv::plot::Plot2d']]], - ['setshowtext_829',['setShowText',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a16493b970b305e0cfc7f40e3a352b67c',1,'cv::plot::Plot2d']]], - ['setsigma_830',['setSigma',['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#aaf401f1032d09910d6851602a3eeed9a',1,'cv::ximgproc::EdgeAwareInterpolator::setSigma()'],['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1ximgproc_1_1segmentation_1_1GraphSegmentation.html#a35bb2fc02d255a7ba81e2de0c0045562',1,'cv::ximgproc::segmentation::GraphSegmentation::setSigma()'],['https://docs.opencv.org/4.2.0/d5/d97/classcv_1_1img__hash_1_1RadialVarianceHash.html#a220ddf8070bf024ef24d23a14d41b9b7',1,'cv::img_hash::RadialVarianceHash::setSigma()'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html#ae130afee934e62a91e5aa29a5feb572c',1,'cv::xfeatures2d::VGG::setSigma()']]], - ['setsigmacolor_831',['setSigmaColor',['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1ximgproc_1_1DisparityWLSFilter.html#a7a3acad02148e8acc581acf6ac3607e5',1,'cv::ximgproc::DisparityWLSFilter::setSigmaColor()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga7dec866735ecbae9e05224958d4585fd',1,'cv::xphoto::TonemapDurand::setSigmaColor()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga7dec866735ecbae9e05224958d4585fd',1,'setSigmaColor()(Global Namespace)']]], - ['setsigmadepth_832',['setSigmaDepth',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#afec3584bcd59b435c38a0062b93c49f4',1,'cv::rgbd::FastICPOdometry']]], - ['setsigmar_833',['setSigmaR',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a67aa879366edccb36bf7ae3be51de9cd',1,'cv::ximgproc::AdaptiveManifoldFilter']]], - ['setsigmarange_834',['setSigmaRange',['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#a1754bd4c0471bd54d875bfc1fb5db409',1,'cv::cuda::DisparityBilateralFilter']]], - ['setsigmas_835',['setSigmaS',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a18fc413287d3dbceb2885d47a9811ff3',1,'cv::ximgproc::AdaptiveManifoldFilter']]], - ['setsigmaspace_836',['setSigmaSpace',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga8869068912fae078699ce931bdc17fc4',1,'cv::xphoto::TonemapDurand::setSigmaSpace()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga8869068912fae078699ce931bdc17fc4',1,'setSigmaSpace()(Global Namespace)']]], - ['setsigmaspatial_837',['setSigmaSpatial',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a6aa58e36d51ec85b5f81ff5778f11629',1,'cv::rgbd::FastICPOdometry']]], - ['setsign_838',['setSign',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga939dba50e8cd4c484e9ab95955d1d07a',1,'cv::softdouble::setSign()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga24ffde1fd1ffbdfee1c033491829cbf7',1,'cv::softfloat::setSign()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga24ffde1fd1ffbdfee1c033491829cbf7',1,'setSign()(Global Namespace)']]], - ['setsize_839',['setSize',['https://docs.opencv.org/4.2.0/d7/d3d/classcv_1_1viz_1_1WImage3D.html#aa8368e3dfed3f8d563297743f9791828',1,'cv::viz::WImage3D']]], - ['setslicspixelsize_840',['setSlicSpixelSize',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#a5affbf9b56a7b0189c4a4f2988df373e',1,'cv::hfs::HfsSegment']]], - ['setsmallerblocksize_841',['setSmallerBlockSize',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#ada787b8648754270796ecc494f1bd584',1,'cv::stereo::StereoBinaryBM::setSmallerBlockSize()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#abb6280255bb070f51ade69d6455216d6',1,'cv::StereoBM::setSmallerBlockSize()']]], - ['setsmallwinsize_842',['setSmallWinSize',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#adf7cf2f4c4b8bf95567b9e856eaeff1c',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['setsmoothingradius_843',['setSmoothingRadius',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a5ffcc3e992b4c99e980978c7554c3ba4',1,'cv::bgsegm::BackgroundSubtractorGMG::setSmoothingRadius()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#ad43b819ade1c5e1900e16bc2e5d17f5a',1,'cv::cuda::BackgroundSubtractorGMG::setSmoothingRadius()']]], - ['setsolveriterations_844',['setSolverIterations',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#a7e714aba53c5947ccc58e04f818d028b',1,'cv::cuda::BroxOpticalFlow::setSolverIterations()'],['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html#af4676086227bd01c01a6ae1049c75ed9',1,'cv::superres::BroxOpticalFlow::setSolverIterations()']]], - ['setsolvertype_845',['setSolverType',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a8beec2719d217a845ce3f0299e4eefc5',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['setsoriterations_846',['setSorIterations',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#a559b86acd9e6f504e34bf475cb70d049',1,'cv::VariationalRefinement']]], - ['setsource_847',['setSource',['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#a20f82ac711832fec1b2be70e7a3785de',1,'cv::GStreamingCompiled::setSource(GRunArgs &&ins)'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#a534f08e6a1438455d38571025bbf321c',1,'cv::GStreamingCompiled::setSource(const gapi::wip::IStreamSource::Ptr &s)']]], - ['setspatialweight_848',['setSpatialWeight',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#aa3813a0d299c006d1d7f6bcae7e54cd7',1,'cv::hfs::HfsSegment']]], - ['setspecklerange_849',['setSpeckleRange',['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#a3c9106923f87592b98bf53e90bcba020',1,'cv::StereoMatcher::setSpeckleRange()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#a9f2f1d87e19dfb3ca82fc9479281a9b3',1,'cv::stereo::StereoMatcher::setSpeckleRange()']]], - ['setspecklewindowsize_850',['setSpeckleWindowSize',['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#ad21033d76ad7cdf36a5c8bb6cd946d43',1,'cv::StereoMatcher::setSpeckleWindowSize()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#a792415b3f9a46dd49a81eb4874d2ced5',1,'cv::stereo::StereoMatcher::setSpeckleWindowSize()']]], - ['setspekleremovaltechnique_851',['setSpekleRemovalTechnique',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#af7e3dccf3b17eb65cf3e0799330e9d27',1,'cv::stereo::StereoBinaryBM::setSpekleRemovalTechnique()'],['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#aeeb346eebf5f305f591b141745b9cff1',1,'cv::stereo::StereoBinarySGBM::setSpekleRemovalTechnique()']]], - ['setsplitnumber_852',['setSplitNumber',['https://docs.opencv.org/4.2.0/d9/dfa/classcv_1_1freetype_1_1FreeType2.html#a572143e6c68eab181387d9f4b3366f8b',1,'cv::freetype::FreeType2']]], - ['setspqrordering_853',['setSPQROrdering',['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a7f0fa283af9cb2114f55a84a134cd603',1,'Eigen::SPQR']]], - ['setstabilizationmotions_854',['setStabilizationMotions',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a68bc03d322d17c9de5bf443b288070e7',1,'cv::videostab::InpainterBase::setStabilizationMotions()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a8010bbd57f273de4a6054513d321c326',1,'cv::videostab::InpaintingPipeline::setStabilizationMotions()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a2a2fc2428a977a015135e9c5d283b366',1,'cv::videostab::WobbleSuppressorBase::setStabilizationMotions()']]], - ['setstabilizedframes_855',['setStabilizedFrames',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#af358007841909b089eb568ac9eb76a79',1,'cv::videostab::InpainterBase::setStabilizedFrames()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#ade99b46eb80ad9db0b7d9d9a0ceb03e3',1,'cv::videostab::InpaintingPipeline::setStabilizedFrames()']]], - ['setstagethreshold_856',['setStageThreshold',['https://docs.opencv.org/4.2.0/d5/d37/structHaarStage64.html#a8ef83f1f3b12e6b9e99b7cbe78986a8a',1,'HaarStage64']]], - ['setstartclassifierrootnodeoffset_857',['setStartClassifierRootNodeOffset',['https://docs.opencv.org/4.2.0/d5/d37/structHaarStage64.html#a8e4a8efe43f64b9a87ad257830c8b412',1,'HaarStage64']]], - ['setstate_858',['setState',['../classcommands_1_1DriveToWaypointCommand.html#a19c20926c6c26f6196d744b5fe51bf07',1,'commands::DriveToWaypointCommand']]], - ['setstate_859',['setstate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'basic_ios< char, _Traits >::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'basic_iostream< char >::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'basic_istream< char >::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'basic_istream< char, _Traits >::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'basic_ostream< char >::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'basic_ostream< char, _Traits >::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_fstream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_ifstream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_ios::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_iostream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_istream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_istringstream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_ofstream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_ostream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_ostringstream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_stringstream::setstate()']]], - ['setstddev_860',['setStdDev',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a655e0cfadf3ca8e2acac038132841183',1,'cv::ShapeContextDistanceExtractor']]], - ['setstdevthresh_861',['setStdevThresh',['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1videostab_1_1ConsistentMosaicInpainter.html#a08f47e6b4674029d42a823e2a8243312',1,'cv::videostab::ConsistentMosaicInpainter']]], - ['setstepdecreasingpower_862',['setStepDecreasingPower',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a681aa5262a86ff0c00c88c5e4dc5f72b',1,'cv::ml::SVMSGD']]], - ['setsubpixelinterpolationmethod_863',['setSubPixelInterpolationMethod',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a575ba986f8ec336f79770d661a65a109',1,'cv::stereo::StereoBinarySGBM']]], - ['setsuperpixelmode_864',['setSuperpixelMode',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a43844b484f6125722b92d67c14cc589e',1,'cv::ximgproc::RICInterpolator']]], - ['setsuperpixelnncnt_865',['setSuperpixelNNCnt',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a315155e5596bd3680f92042399c7b296',1,'cv::ximgproc::RICInterpolator']]], - ['setsuperpixelruler_866',['setSuperpixelRuler',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#ace5cc4443ca08d80238ac85c6b819bdf',1,'cv::ximgproc::RICInterpolator']]], - ['setsuperpixelsize_867',['setSuperpixelSize',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a1ffa08f77ec237ed825c7446517b1bc1',1,'cv::ximgproc::RICInterpolator']]], - ['setsupportregiontype_868',['setSupportRegionType',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a0ee496677b285aa6ee610a1a0126e290',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['setsvmdetector_869',['setSVMDetector',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a5d12db2277b7c3c849d75258eec8d1d4',1,'cv::cuda::HOG::setSVMDetector()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a6de5ac55631eed51e36278cde3a2c159',1,'cv::HOGDescriptor::setSVMDetector()']]], - ['setsvmsgdtype_870',['setSvmsgdType',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#ae0c76a4387f722444128f206ba4dd0fc',1,'cv::ml::SVMSGD']]], - ['settarget_871',['setTarget',['../classcontrol_1_1JacobianPosController.html#a4b44e413b357ec7dff699bee889ffdc8',1,'control::JacobianPosController::setTarget()'],['../classJacobianVelController.html#a7f61cef5d0a88d9125b6e50d7138afb6',1,'JacobianVelController::setTarget()'],['../classcontrol_1_1PIDController.html#a7203448f24fe7ba0c158a436cb4552ac',1,'control::PIDController::setTarget()'],['../classcontrol_1_1TrapezoidalVelocityProfile.html#ae31a956ee6518a948f64280178820094',1,'control::TrapezoidalVelocityProfile::setTarget(robot::types::datatime_t currTime, const std::array< double, dim > &startPos, const std::array< double, dim > &endPos)'],['../classcontrol_1_1TrapezoidalVelocityProfile.html#a0c8c7025b9622eabcb93aada375d3c76',1,'control::TrapezoidalVelocityProfile::setTarget(robot::types::datatime_t currTime, const navtypes::Vectord< dim > &startPos, const navtypes::Vectord< dim > &endPos)'],['../classcontrol_1_1SingleDimTrapezoidalVelocityProfile.html#a284b9cbf9248912e221c6b0a0b93ef46',1,'control::SingleDimTrapezoidalVelocityProfile::setTarget()']]], - ['settargetfg_872',['setTargetFg',['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html#a26ae67f12c55b20a89df448400cee1fc',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerAdaBoostingTargetState::setTargetFg()'],['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html#a0e5d189b5da55a6ac1c752957e2ac304',1,'cv::TrackerStateEstimatorMILBoosting::TrackerMILTargetState::setTargetFg()']]], - ['settargetheight_873',['setTargetHeight',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html#a5263838c2c5b321dada6202e4074ecea',1,'cv::TrackerTargetState']]], - ['settargetposition_874',['setTargetPosition',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html#acf8ce8de65e1702e9862bbf6d1ea6a38',1,'cv::TrackerTargetState']]], - ['settargetresponses_875',['setTargetResponses',['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html#ad54b830d495e2a8a6cd2b99672f75fc6',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerAdaBoostingTargetState']]], - ['settargetwidth_876',['setTargetWidth',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html#a6b9f6a9b2fdbb4d40205b2479386ef0f',1,'cv::TrackerTargetState']]], - ['settau_877',['setTau',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a3987aefe9ac162918d14dc3d94a291ff',1,'cv::optflow::DualTVL1OpticalFlow::setTau()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#ab2d2d6aca00036be8365b83986c293e8',1,'cv::superres::DualTVL1OpticalFlow::setTau()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#ae06f0c80c4250311b730341c5d622f78',1,'cv::cuda::OpticalFlowDual_TVL1::setTau()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a6159d14059c785f82cf489546fe8c233',1,'cv::superres::SuperResolution::setTau()']]], - ['settemplate_878',['setTemplate',['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#ad37bc75bf3054590d10f99cf608f10d5',1,'cv::GeneralizedHough::setTemplate(InputArray templ, Point templCenter=Point(-1, -1))=0'],['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a923534894a0f23563289abcd6cbe74d3',1,'cv::GeneralizedHough::setTemplate(InputArray edges, InputArray dx, InputArray dy, Point templCenter=Point(-1, -1))=0']]], - ['settemporalarearadius_879',['setTemporalAreaRadius',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a28022e488e09fb69f62345b2ca9545e5',1,'cv::superres::SuperResolution']]], - ['settermcriteria_880',['setTermCriteria',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ab6310aa2b5894ceb4e72008e62316182',1,'cv::ml::ANN_MLP::setTermCriteria()'],['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#ae81349da624b7fa2b76eba78b2ffa613',1,'cv::detail::BundleAdjusterBase::setTermCriteria()'],['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ab516e6f125bd4ebc976306e956320313',1,'cv::ml::EM::setTermCriteria()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#acc0490ba09a6dcc3c546d38345490e4b',1,'cv::ml::LogisticRegression::setTermCriteria()'],['https://docs.opencv.org/4.2.0/df/d11/classcv_1_1MinProblemSolver.html#aad56ae718e6cde978cac28e6ae1d58e7',1,'cv::MinProblemSolver::setTermCriteria()'],['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html#a6fb8be4c0c490a5b9ff870adce1a0f20',1,'cv::ml::RTrees::setTermCriteria()'],['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html#a68ffa532d3ebfad03d9473633372633c',1,'cv::SparsePyrLKOpticalFlow::setTermCriteria()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a6a86483c5518c332fedf6ec381a1daa7',1,'cv::ml::SVM::setTermCriteria()'],['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#abf9c385dd82c06d6862c0c2aa62e4efc',1,'cv::ml::SVMSGD::setTermCriteria()']]], - ['settexcoordarray_881',['setTexCoordArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a3bdfb171222d5e7802de3a7c29984fd5',1,'cv::ogl::Arrays']]], - ['settext_882',['setText',['https://docs.opencv.org/4.2.0/de/d0b/classcv_1_1viz_1_1WText.html#ab3c0726018bd632a006c38a1e16b8254',1,'cv::viz::WText::setText()'],['https://docs.opencv.org/4.2.0/d6/d3d/classcv_1_1viz_1_1WText3D.html#a3a18f3dece7c214bbec42593e6a77e7f',1,'cv::viz::WText3D::setText()']]], - ['settexturethreshold_883',['setTextureThreshold',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a640a3cfbd15903dbd7a8622897e4f0c8',1,'cv::stereo::StereoBinaryBM::setTextureThreshold()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#aaee69730b91d606744cc4c5d9d8590e7',1,'cv::StereoBM::setTextureThreshold()']]], - ['settheta_884',['setTheta',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#abbf4d691ccdbe65e6fbdf9b9b3e9305c',1,'cv::optflow::DualTVL1OpticalFlow::setTheta()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#a5cac2c52b3a25953c106325a49f1dbd3',1,'cv::superres::DualTVL1OpticalFlow::setTheta()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#aea12c3df9963eb3a28cdcb81f1018252',1,'cv::cuda::HoughLinesDetector::setTheta()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html#a437ed5509bed40cd17a187e8133058ee',1,'cv::cuda::HoughSegmentDetector::setTheta()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#adcad8d9aeda533fcd49bba4fec924327',1,'cv::cuda::OpticalFlowDual_TVL1::setTheta()']]], - ['setthreshold_885',['setThreshold',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#a0441b248a0567f553a03a857b681f482',1,'cv::AgastFeatureDetector::setThreshold()'],['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#aaeec869ae038190ffac3f38174058b25',1,'cv::AKAZE::setThreshold()'],['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html#a5b9e5e5ee62922e6a3f6cec8110eef26',1,'cv::face::BasicFaceRecognizer::setThreshold()'],['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html#a29e10df2eaef71f2ae3b7183ee3e915a',1,'cv::BRISK::setThreshold()'],['https://docs.opencv.org/4.2.0/d3/d30/classcv_1_1CalibrateRobertson.html#a751f087a7b571130daab29b0fdd6a363',1,'cv::CalibrateRobertson::setThreshold()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#a3182081e5f8023e658ad8ab96656dd63',1,'cv::face::FaceRecognizer::setThreshold()'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a63a6cd2ace658f53f235fe3082104db4',1,'cv::FastFeatureDetector::setThreshold()'],['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#a36ee602f0b43664a1d3369a06eea087c',1,'cv::cuda::FastFeatureDetector::setThreshold()'],['https://docs.opencv.org/4.2.0/de/db5/structHaarClassifierNode128.html#a9219b271e971cd7ae812a3bc98d509ca',1,'HaarClassifierNode128::setThreshold()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#aa962c928a4eeaa619215a318f8dddfc6',1,'cv::cuda::HoughLinesDetector::setThreshold()'],['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#ae338d672a3f1531c9862a410dbdafe69',1,'cv::KAZE::setThreshold()'],['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html#a4b4903dcfaa98192784a41b299360b5c',1,'cv::face::LBPHFaceRecognizer::setThreshold()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#ac600504802956872d403d5ecd20d19ba',1,'cv::rgbd::RgbdPlane::setThreshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ae712cdc9f0e521cfc8061bee58ff55ee',1,'Eigen::ColPivHouseholderQR::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a648df14c457ceceb09d933d06d3bdded',1,'Eigen::ColPivHouseholderQR::setThreshold(Default_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ae712cdc9f0e521cfc8061bee58ff55ee',1,'ColPivHouseholderQR< MatrixType >::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a648df14c457ceceb09d933d06d3bdded',1,'ColPivHouseholderQR< MatrixType >::setThreshold(Default_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#aa9c9f7cbde9d58ca5552381b70ad8d82',1,'Eigen::CompleteOrthogonalDecomposition::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a27c8da71874be7a64d6723bd0cae9f4f',1,'Eigen::CompleteOrthogonalDecomposition::setThreshold(Default_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a92277e572bf98245891015d12dd2b602',1,'Eigen::FullPivHouseholderQR::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aaea4bf3dd145e0cddb16e364cca9d887',1,'Eigen::FullPivHouseholderQR::setThreshold(Default_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a414592d82de98f5bd075965caf56d681',1,'Eigen::FullPivLU::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a1b5e30add3dfb6625da1213d68418f44',1,'Eigen::FullPivLU::setThreshold(Default_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a1c95d05398fc15e410a28560ef70a5a6',1,'Eigen::SVDBase::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a27586b69dbfb63f714d1d45fd6304f97',1,'Eigen::SVDBase::setThreshold(Default_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a1c95d05398fc15e410a28560ef70a5a6',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a27586b69dbfb63f714d1d45fd6304f97',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::setThreshold(Default_t)']]], - ['setthresholddelta_886',['setThresholdDelta',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a7263e051dad91476efdd1d8b57fb11d8',1,'cv::text::ERFilter']]], - ['settilesgridsize_887',['setTilesGridSize',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1CLAHE.html#a3b96ad7aa2dbea70310d74d717bc5c65',1,'cv::CLAHE']]], - ['settings_2eh_888',['settings.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00968.html',1,'']]], - ['setto_889',['setTo',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a5a519caf215925ff10f4286c018905bf',1,'cv::_OutputArray::setTo()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ab263999dea4f7f28d4dd4ced6d2e970b',1,'cv::cuda::GpuMat::setTo(Scalar s)'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#aa155961a4c8c19bdb2c9b1886e45ce9a',1,'cv::cuda::GpuMat::setTo(Scalar s, Stream &stream)'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a16cb9be32213df86f3b55ec131abff70',1,'cv::cuda::GpuMat::setTo(Scalar s, InputArray mask)'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a1090e7ff25e23cf6243809e9a031b51d',1,'cv::cuda::GpuMat::setTo(Scalar s, InputArray mask, Stream &stream)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a0440e2a164c0b0d8462fb1e487be9876',1,'cv::Mat::setTo()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a57513848cc5e55fe2b40bf98dfc99f08',1,'cv::UMat::setTo()']]], - ['settolerance_890',['setTolerance',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#ac160a444af8998f93da9aa30e858470d',1,'Eigen::IterativeSolverBase']]], - ['settrackbarmax_891',['setTrackbarMax',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga7e5437ccba37f1154b65210902fc4480',1,'cv::setTrackbarMax()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga7e5437ccba37f1154b65210902fc4480',1,'setTrackbarMax()(Global Namespace)']]], - ['settrackbarmin_892',['setTrackbarMin',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gabe26ffe8d2b60cc678895595a581b7aa',1,'cv::setTrackbarMin()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gabe26ffe8d2b60cc678895595a581b7aa',1,'setTrackbarMin()(Global Namespace)']]], - ['settrackbarpos_893',['setTrackbarPos',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga67d73c4c9430f13481fd58410d01bd8d',1,'cv::setTrackbarPos()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga67d73c4c9430f13481fd58410d01bd8d',1,'setTrackbarPos()(Global Namespace)']]], - ['settrackerstateestimator_894',['setTrackerStateEstimator',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#afe3cf67b96f53b3e38c67c99856e01d6',1,'cv::TrackerModel']]], - ['settrainingpath_895',['setTrainingPath',['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#aa7f1fc8b9265e355babe73d68d7ca833',1,'cv::saliency::ObjectnessBING']]], - ['settrainmethod_896',['setTrainMethod',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a4be093cfd2e743ee2f41e34e50cf3a54',1,'cv::ml::ANN_MLP::setTrainMethod()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a18934b829da316ac02d18d5a413ab221',1,'cv::ml::LogisticRegression::setTrainMethod()']]], - ['settraintestsplit_897',['setTrainTestSplit',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#ab444173f4d980bb3c18d856df706c920',1,'cv::ml::TrainData']]], - ['settraintestsplitratio_898',['setTrainTestSplitRatio',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#ad59c8df14e133ba492ff5cbfa21244cc',1,'cv::ml::TrainData']]], - ['settransformalgorithm_899',['setTransformAlgorithm',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a537e77faeb22ad21db4c3a45084019ef',1,'cv::ShapeContextDistanceExtractor']]], - ['settransformtype_900',['setTransformType',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a27faa00de58fa54759c392b7a09464fd',1,'cv::rgbd::FastICPOdometry::setTransformType()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a702746d52b26e5803d97e4344389ff26',1,'cv::rgbd::ICPOdometry::setTransformType()'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a8b4b267ab88b06d85cd394a84553181d',1,'cv::rgbd::Odometry::setTransformType()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#ae8d72a324b7f629020000cadde08beef',1,'cv::rgbd::RgbdICPOdometry::setTransformType()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#aa0da99e19e5a13313df45e088ae73007',1,'cv::rgbd::RgbdOdometry::setTransformType()']]], - ['settranslation_901',['setTranslation',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a326cff067288459c6fefa0f3fe313a14',1,'cv::xfeatures2d::PCTSignatures']]], - ['settranslations_902',['setTranslations',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a48a29104ac014ba9adc426ec67568ed7',1,'cv::xfeatures2d::PCTSignatures']]], - ['settreeheight_903',['setTreeHeight',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a2ebe97b627b3dfbabb9ba13511ec27b2',1,'cv::ximgproc::AdaptiveManifoldFilter']]], - ['settrimratio_904',['setTrimRatio',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a41f1a1566344655639a710429db8d811',1,'cv::videostab::LpMotionStabilizer::setTrimRatio()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aac98667cf80a45d764e883b5a02ae152',1,'cv::videostab::StabilizerBase::setTrimRatio()']]], - ['settruncateprunedtree_905',['setTruncatePrunedTree',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a6f2663a08abc3e872bd3f3a53a84615c',1,'cv::ml::DTrees']]], - ['settype_906',['setType',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#a8cfdfacb3adafd3a39d7b46576bcffb7',1,'cv::AgastFeatureDetector::setType()'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#ae9328e37053be0cd740d4db9cb185196',1,'cv::FastFeatureDetector::setType()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a0dd2c2aea178a3c9136eda6443d5bb7b',1,'cv::ml::SVM::setType()']]], - ['setuniquenessratio_907',['setUniquenessRatio',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a4b51d68f13f1bcd8ae3937290a1edcbd',1,'cv::stereo::StereoBinaryBM::setUniquenessRatio()'],['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#ae1611c9592222fa70425e9971023cb1e',1,'cv::stereo::StereoBinarySGBM::setUniquenessRatio()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#ab60fc9ac381c1fde378bbc205f4d5c8f',1,'cv::StereoBM::setUniquenessRatio()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ac7b3c009706c6809211b7c5e79434ebd',1,'cv::StereoSGBM::setUniquenessRatio()']]], - ['setunit_908',['setUnit',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac7cf3e0e69550d36de8778b09a645afd',1,'Eigen::MatrixBase::setUnit(Index i)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90bed3b6468a17a9054b07cde7a751a6',1,'Eigen::MatrixBase::setUnit(Index newSize, Index i)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac7cf3e0e69550d36de8778b09a645afd',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::setUnit(Index i)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90bed3b6468a17a9054b07cde7a751a6',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::setUnit(Index newSize, Index i)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac7cf3e0e69550d36de8778b09a645afd',1,'MatrixBase< Solve< Decomposition, RhsType > >::setUnit(Index i)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90bed3b6468a17a9054b07cde7a751a6',1,'MatrixBase< Solve< Decomposition, RhsType > >::setUnit(Index newSize, Index i)']]], - ['setup_909',['setUp',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#aa91feb58c31962610d94527c424bd27b',1,'cv::videostab::OnePassStabilizer::setUp()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a3106ad788ee8a1c1a8605437c26d111a',1,'cv::videostab::StabilizerBase::setUp()'],['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a3278c9bbe6b30b08a47cb841b8b8eedc',1,'cv::videostab::TwoPassStabilizer::setUp()']]], - ['setup_910',['setup',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a741fc44059111f3e2d5ba6ab1fa1d907',1,'cv::bioinspired::Retina::setup(String retinaParameterFile="", const bool applyDefaultSetupOnFailure=true)=0'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a75ee531b20e2c32892773625de5ecdb1',1,'cv::bioinspired::Retina::setup(cv::FileStorage &fs, const bool applyDefaultSetupOnFailure=true)=0'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#ac9f944965a104c355467628b07eaf887',1,'cv::bioinspired::Retina::setup(RetinaParameters newParameters)=0'],['https://docs.opencv.org/4.2.0/dd/d73/classcv_1_1bioinspired_1_1RetinaFastToneMapping.html#a378b0dccc1fe6f1ee8612d9a8d4c4c5e',1,'cv::bioinspired::RetinaFastToneMapping::setup()'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#a8fb3d6a9684a2a7a4d3f78c51e304610',1,'cv::bioinspired::TransientAreasSegmentationModule::setup(String segmentationParameterFile="", const bool applyDefaultSetupOnFailure=true)=0'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#ace738e02e33d9ced8f2f09e51142c37b',1,'cv::bioinspired::TransientAreasSegmentationModule::setup(cv::FileStorage &fs, const bool applyDefaultSetupOnFailure=true)=0'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#ae446fc8a4f317a23c191af93db7f59e8',1,'cv::bioinspired::TransientAreasSegmentationModule::setup(SegmentationParameters newParameters)=0']]], - ['setupdatebackgroundmodel_911',['setUpdateBackgroundModel',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a3d4f038c6c42c0760784bbf9eabc0f00',1,'cv::bgsegm::BackgroundSubtractorGMG::setUpdateBackgroundModel()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a3209883101789a84629a67e76fcc4312',1,'cv::cuda::BackgroundSubtractorGMG::setUpdateBackgroundModel()']]], - ['setupdategain_912',['setUpdateGain',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#aaf2cec1f829a8d169442ca1f01113b2e',1,'cv::detail::ExposureCompensator']]], - ['setupinitialcameraparams_913',['setUpInitialCameraParams',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a7d3b589d7502dd18a1d1dad898816b2e',1,'cv::detail::BundleAdjusterBase']]], - ['setupiplmagnochannel_914',['setupIPLMagnoChannel',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#acfec2a2bef33e6ef73a38576f645278b',1,'cv::bioinspired::Retina']]], - ['setupoplandiplparvochannel_915',['setupOPLandIPLParvoChannel',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#ac6d6767e14212b5ebd7c5bbc6477fa7a',1,'cv::bioinspired::Retina']]], - ['setupright_916',['setUpright',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#abd5499d92c0a3c89b19ad8ceeb96a1a0',1,'cv::KAZE::setUpright()'],['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html#a7314beab8610f55b472723c34e7d5d06',1,'cv::xfeatures2d::SURF::setUpright()']]], - ['setuse1serule_917',['setUse1SERule',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a08089831f9a07e0ce6a5e5faccdf31f6',1,'cv::ml::DTrees']]], - ['setuseglobalmotionprior_918',['setUseGlobalMotionPrior',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#aa919274bebb04e6e7670ae37ba2b11ec',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['setuseglobalsmootherfilter_919',['setUseGlobalSmootherFilter',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a3dfa809919ae3e5e025df3ee462af74e',1,'cv::ximgproc::RICInterpolator']]], - ['setusehistory_920',['setUseHistory',['https://docs.opencv.org/4.2.0/de/dca/classcv_1_1bgsegm_1_1BackgroundSubtractorCNT.html#aba1d79b65e7ee6fb9d3f40e62b248e9d',1,'cv::bgsegm::BackgroundSubtractorCNT']]], - ['setuseilluminationmodel_921',['setUseIlluminationModel',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a12cc59356f65b7320d30443f932ac38d',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['setuseinitialflow_922',['setUseInitialFlow',['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1cuda_1_1DensePyrLKOpticalFlow.html#a7973d35c2b7037820f1bb68014c248d3',1,'cv::cuda::DensePyrLKOpticalFlow::setUseInitialFlow()'],['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a114451c302634b758c2eb88cf8fca36a',1,'cv::optflow::DualTVL1OpticalFlow::setUseInitialFlow()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#acb23452acc6158e2f037f754ec5329c1',1,'cv::superres::DualTVL1OpticalFlow::setUseInitialFlow()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#a1a7c86120ebf59622b17bd5e02b358a6',1,'cv::cuda::OpticalFlowDual_TVL1::setUseInitialFlow()'],['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#ab32cb9fae52baf0fcf861b480545cb6a',1,'cv::optflow::RLOFOpticalFlowParameter::setUseInitialFlow()'],['https://docs.opencv.org/4.2.0/d7/d05/classcv_1_1cuda_1_1SparsePyrLKOpticalFlow.html#ad9ad6c08b3578ada361e7874ae7cf923',1,'cv::cuda::SparsePyrLKOpticalFlow::setUseInitialFlow()']]], - ['setuseinstrumentation_923',['setUseInstrumentation',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a09cfb71c8b9c9e222a9110b964bb2e5d',1,'cv::instr']]], - ['setuselocalinitdatacost_924',['setUseLocalInitDataCost',['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1cuda_1_1StereoConstantSpaceBP.html#ad4a691146ff2c90cb401c5d2a6667fee',1,'cv::cuda::StereoConstantSpaceBP']]], - ['setusemeannormalization_925',['setUseMeanNormalization',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a9e1ca290c78973995dcfe11da3ca0ea7',1,'cv::DISOpticalFlow']]], - ['setusenormalizedescriptor_926',['setUseNormalizeDescriptor',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html#a6713bbb15a6c7d7a09e4443a1da8c280',1,'cv::xfeatures2d::VGG']]], - ['setusenormalizeimage_927',['setUseNormalizeImage',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html#a37fe514778bc09c09494fd9c292d2155',1,'cv::xfeatures2d::VGG']]], - ['setuseopencl_928',['setUseOpenCL',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gab747fa4efd88d3188f4ebcbc8a639c1e',1,'cv::ocl::setUseOpenCL()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gab747fa4efd88d3188f4ebcbc8a639c1e',1,'setUseOpenCL()(Global Namespace)']]], - ['setuseopenvx_929',['setUseOpenVX',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a054d2cb59acdf42af649bf2ee6be1756',1,'cv']]], - ['setuseoptimized_930',['setUseOptimized',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga3c8487ea4449e550bc39575ede094c7a',1,'cv::setUseOptimized()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga3c8487ea4449e550bc39575ede094c7a',1,'setUseOptimized()(Global Namespace)']]], - ['setusepostproc_931',['setUsePostProc',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a38fe363602cd87c6bef10a80bdb92b4a',1,'cv::optflow::DenseRLOFOpticalFlow']]], - ['setusepostprocessing_932',['setUsePostProcessing',['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#ad0df358fbf08b20453a7cbbaf33cc488',1,'cv::ximgproc::EdgeAwareInterpolator']]], - ['setuseprefilter_933',['setUsePrefilter',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#afa186227703b8206fef449ea213bb003',1,'cv::stereo::StereoBinaryBM']]], - ['setuserng_934',['setUseRNG',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a5634754563f2c06384255ad23c55bff9',1,'cv::ximgproc::AdaptiveManifoldFilter']]], - ['setusescaleorientation_935',['setUseScaleOrientation',['https://docs.opencv.org/4.2.0/d1/dfd/classcv_1_1xfeatures2d_1_1BoostDesc.html#a3589c3c2eb748b7ebb31bcbfea8129cb',1,'cv::xfeatures2d::BoostDesc::setUseScaleOrientation()'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html#af597dce79161a6dcf63151035b6de37c',1,'cv::xfeatures2d::VGG::setUseScaleOrientation()']]], - ['setusespatialpropagation_936',['setUseSpatialPropagation',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#ab34e5d41eba2c1c790eaec99c02d2ac2',1,'cv::DISOpticalFlow']]], - ['setusesurrogates_937',['setUseSurrogates',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a33d8fec217d423609a9f29a0a787111c',1,'cv::ml::DTrees']]], - ['setusesvm_938',['setUseSVM',['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a103147dc9c81aca85ffe02ee7325176a',1,'cv::ocl::Context']]], - ['setusetimstampsdim_939',['setUseTimstampsDim',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a9dc1d18c36710e96396f001503eeae18',1,'cv::dnn::LSTMLayer']]], - ['setusevariationalrefinement_940',['setUseVariationalRefinement',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a8085dd7dfc729a43cc009215299e4c6a',1,'cv::optflow::DenseRLOFOpticalFlow::setUseVariationalRefinement()'],['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#adf0843bcc6e3a9b89d806f35479e83bc',1,'cv::ximgproc::RICInterpolator::setUseVariationalRefinement()']]], - ['setvalue_941',['setValue',['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#a9df30b85b150691694ce9f0fb2ea1757',1,'cv::AsyncPromise::setValue()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a279bef7b343cbe935402be1d1ee8bdcf',1,'cv::FileNode::setValue()']]], - ['setvalues_942',['setValues',['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1EstimatedGaussDistribution.html#aa597b52d3adaece9006f88e66564aa73',1,'cv::EstimatedGaussDistribution']]], - ['setvariationalrefinementalpha_943',['setVariationalRefinementAlpha',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a565bcd4da1df9fcd0bbcb1a3459a1dd5',1,'cv::DISOpticalFlow']]], - ['setvariationalrefinementdelta_944',['setVariationalRefinementDelta',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#ae8bf8a4f43a4c353969dd736350afac4',1,'cv::DISOpticalFlow']]], - ['setvariationalrefinementgamma_945',['setVariationalRefinementGamma',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a7967d16857c013a2c27137f324eb1558',1,'cv::DISOpticalFlow']]], - ['setvariationalrefinementiterations_946',['setVariationalRefinementIterations',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a33f28030c8c7707f9102c1bc1cc09bf3',1,'cv::DISOpticalFlow']]], - ['setvarinit_947',['setVarInit',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a55b91818465653df3672638c1e864bab',1,'cv::BackgroundSubtractorMOG2']]], - ['setvarmax_948',['setVarMax',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a2026951d9331d299f14279d53ffb202a',1,'cv::BackgroundSubtractorMOG2']]], - ['setvarmin_949',['setVarMin',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a62fd4f08f4528a1f849346139d58e863',1,'cv::BackgroundSubtractorMOG2']]], - ['setvarthreshold_950',['setVarThreshold',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#ab58c51659a49f9d8bfdf7062cf4859b5',1,'cv::BackgroundSubtractorMOG2']]], - ['setvarthresholdgen_951',['setVarThresholdGen',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a0afcbbdc16fd13918e2044c2bab10ba4',1,'cv::BackgroundSubtractorMOG2']]], - ['setvertexarray_952',['setVertexArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a56b47850185699e7b248ac16b25dd75a',1,'cv::ogl::Arrays']]], - ['setviewerpose_953',['setViewerPose',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#aff7e90b2280f3ffa95ec63bdce28e267',1,'cv::viz::Viz3d']]], - ['setvocabulary_954',['setVocabulary',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#a9d8425d78fc4e81991a80e471d6089e6',1,'cv::BOWImgDescriptorExtractor']]], - ['setvotesthreshold_955',['setVotesThreshold',['https://docs.opencv.org/4.2.0/dc/d46/classcv_1_1GeneralizedHoughBallard.html#ab848522772940cef12dd36e382a75a5d',1,'cv::GeneralizedHoughBallard::setVotesThreshold()'],['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#ab3290bedb053fc9d1583d9a0170d2c85',1,'cv::cuda::HoughCirclesDetector::setVotesThreshold()']]], - ['setw_956',['setW',['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#a7c000aa5edbe942c480c2cb04f25a213',1,'cv::saliency::ObjectnessBING']]], - ['setw_957',['setw',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2be7f420a95880805d0d7e2543240440',1,'std']]], - ['setwarper_958',['setWarper',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#adb1219c1caae710736a5a5e6b13ad21b',1,'cv::Stitcher']]], - ['setwarpingsnumber_959',['setWarpingsNumber',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#af4cbe53b38cdd46e0ac93400e79d09d3',1,'cv::optflow::DualTVL1OpticalFlow::setWarpingsNumber()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#a2ff5a6cdee569406bb0e598e7455449c',1,'cv::superres::DualTVL1OpticalFlow::setWarpingsNumber()']]], - ['setwavecorrection_960',['setWaveCorrection',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a968a2f4a1faddfdacbcfce54b44bab70',1,'cv::Stitcher']]], - ['setwavecorrectkind_961',['setWaveCorrectKind',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a17413f5c06e4e569bfd45e01d4e8ff4a',1,'cv::Stitcher']]], - ['setweakcount_962',['setWeakCount',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a53c6a2b7dbe717872b32c1659ce9b032',1,'cv::ml::Boost']]], - ['setweight_963',['setWeight',['https://docs.opencv.org/4.2.0/d1/d74/structHaarFeature64.html#ab565bd4a42ee7091c3130106000f5383',1,'HaarFeature64::setWeight()'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a644513e799afdefdb0e37a1bb4abc2d7',1,'cv::xfeatures2d::PCTSignatures::setWeight()']]], - ['setweight1_964',['setWeight1',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a8b2b01a104671f9fd6dd6518fb3ce1a8',1,'cv::videostab::LpMotionStabilizer']]], - ['setweight2_965',['setWeight2',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#af7bb33735451b27d34177bc3491a8670',1,'cv::videostab::LpMotionStabilizer']]], - ['setweight3_966',['setWeight3',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#acb11f0167a147074452b34050d8b5297',1,'cv::videostab::LpMotionStabilizer']]], - ['setweight4_967',['setWeight4',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a13f4c831757489d682476448bbe62549',1,'cv::videostab::LpMotionStabilizer']]], - ['setweighta_968',['setWeightA',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#adb1cdee9bc21e1486795970ad4f5226f',1,'cv::xfeatures2d::PCTSignatures']]], - ['setweightb_969',['setWeightB',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a076170589f3fe0c1f306e42a5a3e2962',1,'cv::xfeatures2d::PCTSignatures']]], - ['setweightcontrast_970',['setWeightContrast',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#aefbda82326aa30a385616a609e653097',1,'cv::xfeatures2d::PCTSignatures']]], - ['setweightentropy_971',['setWeightEntropy',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#ad4284dee436fef8bbc5153cf01cc69db',1,'cv::xfeatures2d::PCTSignatures']]], - ['setweightl_972',['setWeightL',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#abc703d4edfecaeae94dfdab813fff5f1',1,'cv::xfeatures2d::PCTSignatures']]], - ['setweights_973',['setWeights',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a57b036d9f54ec982203bd63ea42559a0',1,'cv::dnn::LSTMLayer::setWeights()'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a0fcdbc44a5a48b4b24e6c182ca7045f7',1,'cv::xfeatures2d::PCTSignatures::setWeights()'],['https://docs.opencv.org/4.2.0/dd/dfd/classcv_1_1dnn_1_1RNNLayer.html#a115817278a78736e2e77671eb0a04279',1,'cv::dnn::RNNLayer::setWeights()']]], - ['setweighttrimrate_974',['setWeightTrimRate',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#aa5880dc1bd70c5413bf5feb19ae03322',1,'cv::ml::Boost']]], - ['setweightx_975',['setWeightX',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#ab92c90a1047a839b7946c6711eafb678',1,'cv::xfeatures2d::PCTSignatures']]], - ['setweighty_976',['setWeightY',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#ac7a4326f24547f0e21f5b14c0e91d7f7',1,'cv::xfeatures2d::PCTSignatures']]], - ['setwhitelist_977',['setWhiteList',['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html#a8da3a4ea4f7fab0f5030a9cf3675b197',1,'cv::text::OCRTesseract']]], - ['setwhitethreshold_978',['setWhiteThreshold',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1structured__light_1_1GrayCodePattern.html#aeaf08cd487c5d2894eda4ebd1eea6322',1,'cv::structured_light::GrayCodePattern']]], - ['setwidgetpose_979',['setWidgetPose',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#ad8524056718268079708503d5f9e2a12',1,'cv::viz::Viz3d']]], - ['setwidthofband_980',['setWidthOfBand',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#afe10048428e4b8768a494c7aca5cc154',1,'cv::line_descriptor::BinaryDescriptor']]], - ['setwindowposition_981',['setWindowPosition',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a0f5c64d835a2350065a7dbbd741f26f8',1,'cv::viz::Viz3d']]], - ['setwindowproperty_982',['setWindowProperty',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga66e4a6db4d4e06148bcdfe0d70a5df27',1,'cv::setWindowProperty()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga66e4a6db4d4e06148bcdfe0d70a5df27',1,'setWindowProperty()(Global Namespace)']]], - ['setwindowradius_983',['setWindowRadius',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a424bb76f76544c6f04777d806a033541',1,'cv::xfeatures2d::PCTSignatures']]], - ['setwindowsize_984',['setWindowSize',['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#a3febec742396f7fc02bcb95d78e51f5a',1,'cv::viz::Camera::setWindowSize()'],['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#aa55d53902b5d121994d905c5d842fc3e',1,'cv::rgbd::DepthCleaner::setWindowSize()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#a05d03196a2428dcf56e28b7c22614f62',1,'cv::superres::FarnebackOpticalFlow::setWindowSize()'],['https://docs.opencv.org/4.2.0/de/d2b/classcv_1_1superres_1_1PyrLKOpticalFlow.html#a73a65396d9d133a05a8353a51bab1109',1,'cv::superres::PyrLKOpticalFlow::setWindowSize()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#ac17b20101f2063cf0df974cc5ba39a4d',1,'cv::rgbd::RgbdNormals::setWindowSize()'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a7fb977094a1fe0494136028b35518fa0',1,'cv::viz::Viz3d::setWindowSize()']]], - ['setwindowtitle_985',['setWindowTitle',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga56f8849295fd10d0c319724ddb773d96',1,'cv::setWindowTitle()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga56f8849295fd10d0c319724ddb773d96',1,'setWindowTitle()(Global Namespace)']]], - ['setwinsigma_986',['setWinSigma',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#ab291779ff8ac649174b102f64c5f9012',1,'cv::cuda::HOG']]], - ['setwinsize_987',['setWinSize',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a6a2bf0ae58a6d3474ed9d8071777e45a',1,'cv::CvHaarEvaluator::setWinSize(Size patchSize)'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a80868059bfa4a6408eadd308c4fd5439',1,'cv::CvHaarEvaluator::setWinSize() const'],['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1cuda_1_1DensePyrLKOpticalFlow.html#a9151702e0186460e99583b236b82ad99',1,'cv::cuda::DensePyrLKOpticalFlow::setWinSize()'],['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#aac38b4be9d384303cd196562df65a42c',1,'cv::FarnebackOpticalFlow::setWinSize()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#a1318d300f9621bfa26be459750aa46eb',1,'cv::cuda::FarnebackOpticalFlow::setWinSize()'],['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html#a55c27f213c1925d78319fdfdf5c8e3db',1,'cv::videostab::PyrLkOptFlowEstimatorBase::setWinSize()'],['https://docs.opencv.org/4.2.0/d7/d05/classcv_1_1cuda_1_1SparsePyrLKOpticalFlow.html#a10252abdc48787ee10db950dbc46fa91',1,'cv::cuda::SparsePyrLKOpticalFlow::setWinSize()'],['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html#a1af197164636e701cc34224e10284d36',1,'cv::SparsePyrLKOpticalFlow::setWinSize()']]], - ['setwinstride_988',['setWinStride',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a5e74646651209ae13f1b3dd18179773f',1,'cv::cuda::HOG']]], - ['setwobblesuppressor_989',['setWobbleSuppressor',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#ad0a574ccd17df9d2a59acee82fad97a0',1,'cv::videostab::TwoPassStabilizer']]], - ['setwta_5fk_990',['setWTA_K',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#ac499c951d4ed95733872ef7264096198',1,'cv::ORB']]], - ['setxi_991',['setXi',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a458db3935a496e66c631745ceeb6ca8a',1,'cv::GeneralizedHoughGuil']]], - ['setzero_992',['setZero',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af230a143de50695d2d1fae93db7e4dcb',1,'Eigen::DenseBase::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af230a143de50695d2d1fae93db7e4dcb',1,'DenseBase< ArrayWrapper< ExpressionType > >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af230a143de50695d2d1fae93db7e4dcb',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af230a143de50695d2d1fae93db7e4dcb',1,'DenseBase< Solve< Decomposition, RhsType > >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#ad4d81f0bf2bdb022d1910a89a6f8c819',1,'Eigen::DiagonalMatrix::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a293457cb23a0a2c95c44a1c6101ef218',1,'Eigen::DiagonalMatrix::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a776d0ab6c980847297d25b03b5d2216a',1,'Eigen::LDLT::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'Eigen::PlainObjectBase::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'Eigen::PlainObjectBase::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'Eigen::PlainObjectBase::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'Eigen::PlainObjectBase::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3c7416090f913e8685523cb3ab7c2f7',1,'Eigen::SparseMatrix::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3c7416090f913e8685523cb3ab7c2f7',1,'SparseMatrix< Scalar >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3c7416090f913e8685523cb3ab7c2f7',1,'SparseMatrix< Scalar, ColMajor, int >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3c7416090f913e8685523cb3ab7c2f7',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3c7416090f913e8685523cb3ab7c2f7',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a7530e86074859407aaec5132549b40ee',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::setZero()']]], - ['sf_5fbgr_993',['SF_BGR',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cba4984532228f149a206ed70dc7be2b054',1,'cv::cudacodec::SF_BGR'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cba4984532228f149a206ed70dc7be2b054',1,'SF_BGR(Global Namespace)']]], - ['sf_5fgray_994',['SF_GRAY',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbaa380f41af7e9c6dc9fb0811bbbadc52e',1,'cv::cudacodec::SF_GRAY'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbaa380f41af7e9c6dc9fb0811bbbadc52e',1,'SF_GRAY(Global Namespace)']]], - ['sf_5fiyuv_995',['SF_IYUV',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbae762b2d49e4da60176d7fa421e2e58cb',1,'cv::cudacodec::SF_IYUV'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbae762b2d49e4da60176d7fa421e2e58cb',1,'SF_IYUV(Global Namespace)']]], - ['sf_5fnv12_996',['SF_NV12',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbae657d7c1840a839a72084d28fffe1798',1,'cv::cudacodec::SF_NV12'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbae657d7c1840a839a72084d28fffe1798',1,'SF_NV12(Global Namespace)']]], - ['sf_5fuyvy_997',['SF_UYVY',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbaa08bc5c4df5b13ef55344dbaa7d776aa',1,'cv::cudacodec::SF_UYVY'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbaa08bc5c4df5b13ef55344dbaa7d776aa',1,'SF_UYVY(Global Namespace)']]], - ['sf_5fyuy2_998',['SF_YUY2',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cba10e3c0d2167a7c73c519b7ac9f54d4b6',1,'cv::cudacodec::SF_YUY2'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cba10e3c0d2167a7c73c519b7ac9f54d4b6',1,'SF_YUY2(Global Namespace)']]], - ['sf_5fyv12_999',['SF_YV12',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbaeb34ec62ac19eab0731d4ce8040ddb30',1,'cv::cudacodec::SF_YV12'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbaeb34ec62ac19eab0731d4ce8040ddb30',1,'SF_YV12(Global Namespace)']]], - ['sfm_20module_20installation_1000',['SFM module installation',['https://docs.opencv.org/4.2.0/db/db8/tutorial_sfm_installation.html',1,'']]], - ['sfm_2ehpp_1001',['sfm.hpp',['https://docs.opencv.org/4.2.0/d3/df9/sfm_8hpp.html',1,'']]], - ['sfm_5fdistortion_5fmodel_5fdivision_1002',['SFM_DISTORTION_MODEL_DIVISION',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#gga01602a9fa571c97ac52b35350e4c48fbaad60cf064485340c3f5bd866b98dea56',1,'cv::sfm::SFM_DISTORTION_MODEL_DIVISION'],['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#gga01602a9fa571c97ac52b35350e4c48fbaad60cf064485340c3f5bd866b98dea56',1,'SFM_DISTORTION_MODEL_DIVISION(Global Namespace)']]], - ['sfm_5fdistortion_5fmodel_5fpolynomial_1003',['SFM_DISTORTION_MODEL_POLYNOMIAL',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#gga01602a9fa571c97ac52b35350e4c48fbaed2c8936165cc35b920a6e45089f5d57',1,'cv::sfm::SFM_DISTORTION_MODEL_POLYNOMIAL'],['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#gga01602a9fa571c97ac52b35350e4c48fbaed2c8936165cc35b920a6e45089f5d57',1,'SFM_DISTORTION_MODEL_POLYNOMIAL(Global Namespace)']]], - ['sfm_5fimport_5freconstruction_2emarkdown_1004',['sfm_import_reconstruction.markdown',['https://docs.opencv.org/4.2.0/db/d43/sfm__import__reconstruction_8markdown.html',1,'']]], - ['sfm_5finstallation_2emarkdown_1005',['sfm_installation.markdown',['https://docs.opencv.org/4.2.0/d4/dbe/sfm__installation_8markdown.html',1,'']]], - ['sfm_5fio_5fbundler_1006',['SFM_IO_BUNDLER',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032abf49ab84b44c1c6bec4b68b268001941',1,'cv::sfm::SFM_IO_BUNDLER'],['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032abf49ab84b44c1c6bec4b68b268001941',1,'SFM_IO_BUNDLER(Global Namespace)']]], - ['sfm_5fio_5fopenmvg_1007',['SFM_IO_OPENMVG',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a1b9130c03a4bd60d285ac4d56065fa51',1,'cv::sfm::SFM_IO_OPENMVG'],['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a1b9130c03a4bd60d285ac4d56065fa51',1,'SFM_IO_OPENMVG(Global Namespace)']]], - ['sfm_5fio_5fopensfm_1008',['SFM_IO_OPENSFM',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a87f8db6b133638d9397579067dc900ca',1,'cv::sfm::SFM_IO_OPENSFM'],['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a87f8db6b133638d9397579067dc900ca',1,'SFM_IO_OPENSFM(Global Namespace)']]], - ['sfm_5fio_5ftheiasfm_1009',['SFM_IO_THEIASFM',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a3b88a1709635d73d377870d7b09f2690',1,'cv::sfm::SFM_IO_THEIASFM'],['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a3b88a1709635d73d377870d7b09f2690',1,'SFM_IO_THEIASFM(Global Namespace)']]], - ['sfm_5fio_5fvisualsfm_1010',['SFM_IO_VISUALSFM',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a777693dd917a3358b58f64061227bf42',1,'cv::sfm::SFM_IO_VISUALSFM'],['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a777693dd917a3358b58f64061227bf42',1,'SFM_IO_VISUALSFM(Global Namespace)']]], - ['sfm_5frefine_5ffocal_5flength_1011',['SFM_REFINE_FOCAL_LENGTH',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a6530505c3c95c8d634079f893f89ffb9',1,'cv::sfm::SFM_REFINE_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a6530505c3c95c8d634079f893f89ffb9',1,'SFM_REFINE_FOCAL_LENGTH(Global Namespace)']]], - ['sfm_5frefine_5fprincipal_5fpoint_1012',['SFM_REFINE_PRINCIPAL_POINT',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a09e0f30a18c69bedcda6062294393665',1,'cv::sfm::SFM_REFINE_PRINCIPAL_POINT'],['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a09e0f30a18c69bedcda6062294393665',1,'SFM_REFINE_PRINCIPAL_POINT(Global Namespace)']]], - ['sfm_5frefine_5fradial_5fdistortion_5fk1_1013',['SFM_REFINE_RADIAL_DISTORTION_K1',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a8ee40c6701881a34b95a1c39ed1ce6b8',1,'cv::sfm::SFM_REFINE_RADIAL_DISTORTION_K1'],['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a8ee40c6701881a34b95a1c39ed1ce6b8',1,'SFM_REFINE_RADIAL_DISTORTION_K1(Global Namespace)']]], - ['sfm_5frefine_5fradial_5fdistortion_5fk2_1014',['SFM_REFINE_RADIAL_DISTORTION_K2',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a59c1a1d32d8dc6f0e65c439b3687c86f',1,'cv::sfm::SFM_REFINE_RADIAL_DISTORTION_K2'],['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a59c1a1d32d8dc6f0e65c439b3687c86f',1,'SFM_REFINE_RADIAL_DISTORTION_K2(Global Namespace)']]], - ['sfm_5fscene_5freconstruction_2emarkdown_1015',['sfm_scene_reconstruction.markdown',['https://docs.opencv.org/4.2.0/dc/d39/sfm__scene__reconstruction_8markdown.html',1,'']]], - ['sfm_5ftrajectory_5festimation_2emarkdown_1016',['sfm_trajectory_estimation.markdown',['https://docs.opencv.org/4.2.0/d3/d94/sfm__trajectory__estimation_8markdown.html',1,'']]], - ['sfmlibmveuclideanreconstruction_1017',['SFMLibmvEuclideanReconstruction',['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html',1,'cv::sfm']]], - ['sgd_1018',['SGD',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#ab028695cc8ec1491888d8d03f80bc8c2ab85c6ad25c382a69f12a7b5d970cb112',1,'cv::ml::SVMSGD']]], - ['sgetc_1019',['sgetc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'__gnu_cxx::enc_filebuf::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'__gnu_cxx::stdio_filebuf::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'__gnu_cxx::stdio_sync_filebuf::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'basic_filebuf< char_type, traits_type >::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'basic_streambuf< _Elem, _Tr >::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'basic_streambuf< char, _Traits >::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'basic_streambuf< char, char_traits< char > >::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'std::basic_filebuf::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'std::basic_streambuf::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'std::basic_stringbuf::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'std::wbuffer_convert::sgetc()']]], - ['sgetn_1020',['sgetn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'__gnu_cxx::enc_filebuf::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'__gnu_cxx::stdio_filebuf::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'__gnu_cxx::stdio_sync_filebuf::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'basic_filebuf< char_type, traits_type >::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'basic_streambuf< _Elem, _Tr >::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'basic_streambuf< char, _Traits >::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'basic_streambuf< char, char_traits< char > >::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'std::basic_filebuf::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'std::basic_streambuf::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'std::basic_stringbuf::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'std::wbuffer_convert::sgetn()']]], - ['sgi_1021',['SGI',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html',1,'']]], - ['shading_1022',['SHADING',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca01452d0c5c4ba91f3d0cb1aa94cf9b36',1,'cv::viz::SHADING'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca01452d0c5c4ba91f3d0cb1aa94cf9b36',1,'SHADING(Global Namespace)']]], - ['shading_5fflat_1023',['SHADING_FLAT',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggaf05708ceb519dea9e16744b5fd56c5e2ac1d13fb38b0b5feb9b38385efd7ff970',1,'cv::viz::SHADING_FLAT'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggaf05708ceb519dea9e16744b5fd56c5e2ac1d13fb38b0b5feb9b38385efd7ff970',1,'SHADING_FLAT(Global Namespace)']]], - ['shading_5fgouraud_1024',['SHADING_GOURAUD',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggaf05708ceb519dea9e16744b5fd56c5e2af649f45acd495f6c82a4da9a9fc367fe',1,'cv::viz::SHADING_GOURAUD'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggaf05708ceb519dea9e16744b5fd56c5e2af649f45acd495f6c82a4da9a9fc367fe',1,'SHADING_GOURAUD(Global Namespace)']]], - ['shading_5fphong_1025',['SHADING_PHONG',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggaf05708ceb519dea9e16744b5fd56c5e2a9f5dda86ef76075b021ab066af408fbd',1,'cv::viz::SHADING_PHONG'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggaf05708ceb519dea9e16744b5fd56c5e2a9f5dda86ef76075b021ab066af408fbd',1,'SHADING_PHONG(Global Namespace)']]], - ['shadingvalues_1026',['ShadingValues',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gaf05708ceb519dea9e16744b5fd56c5e2',1,'cv::viz::ShadingValues'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gaf05708ceb519dea9e16744b5fd56c5e2',1,'ShadingValues(Global Namespace)']]], - ['shape_1027',['shape',['https://docs.opencv.org/4.2.0/da/d1b/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GArray_3_01T_01_4_01_4.html#ac3001f5e2adac265aa5c3fdddfaf0c6a',1,'cv::detail::GTypeTraits< cv::GArray< T > >::shape'],['https://docs.opencv.org/4.2.0/d0/d17/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GMat_01_4.html#af06bf4c84018ab41553899390e586e7c',1,'cv::detail::GTypeTraits< cv::GMat >::shape'],['https://docs.opencv.org/4.2.0/df/d42/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GMatP_01_4.html#a018358568e48e311f0f204d6d4b44926',1,'cv::detail::GTypeTraits< cv::GMatP >::shape'],['https://docs.opencv.org/4.2.0/dc/db5/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GScalar_01_4.html#a8fd029fb4a3aef7506964d90ce5e7d11',1,'cv::detail::GTypeTraits< cv::GScalar >::shape'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a270ae5dc357c85f7fec6d94470b52189',1,'cv::dnn::shape(const int *dims, const int n)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a4945f789f41ace4a6c6f04bcbf722eb8',1,'cv::dnn::shape(const Mat &mat)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#ae9fde5a054f96266528e875c5a67d338',1,'cv::dnn::shape(const MatSize &sz)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a0eba3cf13e42df5456b480161f62eb22',1,'cv::dnn::shape(const UMat &mat)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#aee924c1bbfcc83e730882abcdbe49d06',1,'cv::dnn::shape(int a0, int a1=-1, int a2=-1, int a3=-1)']]], - ['shape_20descriptors_1028',['Structural Analysis and Shape Descriptors',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'']]], - ['shape_20distance_20and_20matching_1029',['Shape Distance and Matching',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html',1,'']]], - ['shape_2ehpp_1030',['shape.hpp',['https://docs.opencv.org/4.2.0/db/d0f/shape_2shape_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d30/shape_8hpp.html',1,'(Global Namespace)']]], - ['shape_5faffinity_5fw_1031',['shape_affinity_w',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#aeaa30b59ae419379b13bef9afbd03476',1,'cv::tbm::TrackerParams']]], - ['shape_5fdistance_2ehpp_1032',['shape_distance.hpp',['https://docs.opencv.org/4.2.0/d4/d7c/shape__distance_8hpp.html',1,'']]], - ['shape_5foffset_1033',['shape_offset',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a77a7ae55fe679ff7e5b6556a979c2b3c',1,'cv::face::FacemarkLBF::Params']]], - ['shape_5ftransformer_2ehpp_1034',['shape_transformer.hpp',['https://docs.opencv.org/4.2.0/dc/d27/shape__transformer_8hpp.html',1,'']]], - ['shape_5futils_2ehpp_1035',['shape_utils.hpp',['https://docs.opencv.org/4.2.0/d1/ddb/shape__utils_8hpp.html',1,'']]], - ['shapecontextdistanceextractor_1036',['ShapeContextDistanceExtractor',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html',1,'cv']]], - ['shapedistanceextractor_1037',['ShapeDistanceExtractor',['https://docs.opencv.org/4.2.0/dc/dbf/classcv_1_1ShapeDistanceExtractor.html',1,'cv']]], - ['shapematchmodes_1038',['ShapeMatchModes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf2b97a230b51856d09a2d934b78c015f',1,'cv::ShapeMatchModes'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf2b97a230b51856d09a2d934b78c015f',1,'ShapeMatchModes(Global Namespace)']]], - ['shapetransformer_1039',['ShapeTransformer',['https://docs.opencv.org/4.2.0/df/dfe/classcv_1_1ShapeTransformer.html',1,'cv']]], - ['shared_1040',['SHARED',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#aa0d69b2aa95680a6b2af6dc4dda44e16ac5eb57263e17573194ea66ab06b1bdb6',1,'cv::cuda::HostMem']]], - ['shared_5fatomics_1041',['SHARED_ATOMICS',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a63dd888f7ac8c7e6716af80bb9580ad5',1,'cv::cuda::SHARED_ATOMICS'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a63dd888f7ac8c7e6716af80bb9580ad5',1,'SHARED_ATOMICS(Global Namespace)']]], - ['shared_5ffuture_1042',['shared_future',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02243.html',1,'std::shared_future< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02243.html#a7abac9b976a7f293a80951ddc77c61a9',1,'std::shared_future::shared_future(const shared_future &__sf) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02243.html#aa1f48e4ac60e93f1eccaf5c4992e5af9',1,'std::shared_future::shared_future(future< _Res > &&__uf) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02243.html#a39eb67ba5bfeda967888f6f8fafd0de8',1,'std::shared_future::shared_future(shared_future &&__sf) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02359.html#abf5c5217a5d88d363cf2b0c09b44b4a0',1,'std::shared_future< _Res & >::shared_future(const shared_future &__sf)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02359.html#a9fa8ab7bbe6469a0d4f3f2e246db6a8d',1,'std::shared_future< _Res & >::shared_future(future< _Res & > &&__uf) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02359.html#ae6d05bb66171df7a69ccbcf3d0a14059',1,'std::shared_future< _Res & >::shared_future(shared_future &&__sf) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02363.html#ad638460091d07d1688a8fdb974acacc5',1,'std::shared_future< void >::shared_future(const shared_future &__sf)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02363.html#a98919d50a2faca6306005a458236176f',1,'std::shared_future< void >::shared_future(future< void > &&__uf) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02363.html#ad2689035011932d007e07c10e1e48d47',1,'std::shared_future< void >::shared_future(shared_future &&__sf) noexcept']]], - ['shared_5ffuture_3c_20_5fres_20_26_20_3e_1043',['shared_future< _Res & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02359.html',1,'std']]], - ['shared_5ffuture_3c_20void_20_3e_1044',['shared_future< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02363.html',1,'std']]], - ['shared_5flock_1045',['shared_lock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02783.html',1,'std']]], - ['shared_5flock_5fguard_1046',['shared_lock_guard',['https://docs.opencv.org/4.2.0/d9/d7f/classcv_1_1utils_1_1shared__lock__guard.html',1,'cv::utils::shared_lock_guard< class >'],['https://docs.opencv.org/4.2.0/d9/d7f/classcv_1_1utils_1_1shared__lock__guard.html#aa7dda3bed283ad9fc84e0449fc0546c0',1,'cv::utils::shared_lock_guard::shared_lock_guard()']]], - ['shared_5fmutex_1047',['shared_mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00137.html',1,'']]], - ['shared_5fptr_1048',['shared_ptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std::shared_ptr< _Tp >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< _Dir >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< _Dir >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< _Dir >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< _Dir >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< _Dir >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< _Dir >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< _Dir >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< _Dir >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< _Dir >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< _Dir >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< _Dir >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< _Dir >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< _Dir_stack >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< _Dir_stack >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< _Dir_stack >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< _Dir_stack >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< _Dir_stack >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< _Dir_stack >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< _Dir_stack >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< _Dir_stack >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< _Dir_stack >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< _Dir_stack >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< _Dir_stack >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< _Dir_stack >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< _RegexT >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< _RegexT >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< _RegexT >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< _RegexT >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< _RegexT >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< _RegexT >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< _RegexT >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< _RegexT >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< _RegexT >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< _RegexT >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< _RegexT >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< _RegexT >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< _State >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< _State >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< _State >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< _State >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< _State >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< _State >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< _State >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< _State >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< _State >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< _State >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< _State >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< _State >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< _State_base >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< _State_base >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< _State_base >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< _State_base >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< _State_base >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< _State_base >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< _State_base >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< _State_base >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< _State_base >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< _State_base >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< _State_base >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< _State_base >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< _State_type >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< _State_type >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< _State_type >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< _State_type >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< _State_type >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< _State_type >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< _State_type >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< _State_type >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< _State_type >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< _State_type >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< _State_type >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< _State_type >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< std::mutex >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< std::mutex >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< std::mutex >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< std::mutex >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< std::mutex >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< std::mutex >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< std::mutex >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< std::mutex >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< std::mutex >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< std::mutex >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< std::mutex >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< std::mutex >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'std::shared_ptr::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'std::shared_ptr::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'std::shared_ptr::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'std::shared_ptr::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'std::shared_ptr::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'std::shared_ptr::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'std::shared_ptr::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'std::shared_ptr::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'std::shared_ptr::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'std::shared_ptr::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'std::shared_ptr::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'std::shared_ptr::shared_ptr(nullptr_t) noexcept']]], - ['shared_5fptr_3c_20_5fdir_20_3e_1049',['shared_ptr< _Dir >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], - ['shared_5fptr_3c_20_5fdir_5fstack_20_3e_1050',['shared_ptr< _Dir_stack >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], - ['shared_5fptr_3c_20_5fregext_20_3e_1051',['shared_ptr< _RegexT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], - ['shared_5fptr_3c_20_5fstate_20_3e_1052',['shared_ptr< _State >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], - ['shared_5fptr_3c_20_5fstate_5fbase_20_3e_1053',['shared_ptr< _State_base >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], - ['shared_5fptr_3c_20_5fstate_5ftype_20_3e_1054',['shared_ptr< _State_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], - ['shared_5fptr_3c_20ar_3a_3amarkerset_20_3e_1055',['shared_ptr< AR::MarkerSet >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20bool_20_3e_1056',['shared_ptr< bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20const_20_5f_5fdetail_3a_3a_5fnfa_3c_20_5frx_5ftraits_20_3e_20_3e_1057',['shared_ptr< const __detail::_NFA< _Rx_traits > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], - ['shared_5fptr_3c_20const_20cv_3a_3aoptflow_3a_3apcaprior_20_3e_1058',['shared_ptr< const cv::optflow::PCAPrior >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20const_20kinematics_3a_3aforwardarmkinematics_3c_20d_2c_20n_20_3e_20_3e_1059',['shared_ptr< const kinematics::ForwardArmKinematics< D, N > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20const_20kinematics_3a_3ainversearmkinematics_3c_20d_2c_20n_20_3e_20_3e_1060',['shared_ptr< const kinematics::InverseArmKinematics< D, N > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3aaruco_3a_3adetectorparameters_20_3e_1061',['shared_ptr< cv::aruco::DetectorParameters >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3aaruco_3a_3adictionary_20_3e_1062',['shared_ptr< cv::aruco::Dictionary >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3abasecascadeclassifier_20_3e_1063',['shared_ptr< cv::BaseCascadeClassifier >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3adescriptormatcher_20_3e_1064',['shared_ptr< cv::DescriptorMatcher >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3adetail_3a_3afeaturesmatcher_20_3e_1065',['shared_ptr< cv::detail::FeaturesMatcher >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3adetail_3a_3atypehintbase_20_3e_1066',['shared_ptr< cv::detail::TypeHintBase >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3adetectionbasedtracker_3a_3aidetector_20_3e_1067',['shared_ptr< cv::DetectionBasedTracker::IDetector >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3afeature2d_20_3e_1068',['shared_ptr< cv::Feature2D >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3amat_20_3e_1069',['shared_ptr< cv::Mat >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3aml_3a_3asvm_20_3e_1070',['shared_ptr< cv::ml::SVM >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3aquality_3a_3aqualitymse_20_3e_1071',['shared_ptr< cv::quality::QualityMSE >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3argbd_3a_3argbdnormals_20_3e_1072',['shared_ptr< cv::rgbd::RgbdNormals >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3astrongclassifierdirectselection_20_3e_1073',['shared_ptr< cv::StrongClassifierDirectSelection >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3atext_3a_3aocrbeamsearchdecoder_3a_3aclassifiercallback_20_3e_1074',['shared_ptr< cv::text::OCRBeamSearchDecoder::ClassifierCallback >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3atext_3a_3aocrhmmdecoder_3a_3aclassifiercallback_20_3e_1075',['shared_ptr< cv::text::OCRHMMDecoder::ClassifierCallback >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3atrackerfeatureset_20_3e_1076',['shared_ptr< cv::TrackerFeatureSet >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3atrackermodel_20_3e_1077',['shared_ptr< cv::TrackerModel >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3atrackersampler_20_3e_1078',['shared_ptr< cv::TrackerSampler >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3atrackerstateestimator_20_3e_1079',['shared_ptr< cv::TrackerStateEstimator >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3atracking_3a_3aukfsystemmodel_20_3e_1080',['shared_ptr< cv::tracking::UkfSystemModel >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3avideocapture_20_3e_1081',['shared_ptr< cv::VideoCapture >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3adeblurerbase_20_3e_1082',['shared_ptr< cv::videostab::DeblurerBase >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3aiframesource_20_3e_1083',['shared_ptr< cv::videostab::IFrameSource >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3ailog_20_3e_1084',['shared_ptr< cv::videostab::ILog >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3aimagemotionestimatorbase_20_3e_1085',['shared_ptr< cv::videostab::ImageMotionEstimatorBase >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3aimotionstabilizer_20_3e_1086',['shared_ptr< cv::videostab::IMotionStabilizer >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3ainpainterbase_20_3e_1087',['shared_ptr< cv::videostab::InpainterBase >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3amotionfilterbase_20_3e_1088',['shared_ptr< cv::videostab::MotionFilterBase >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3awobblesuppressorbase_20_3e_1089',['shared_ptr< cv::videostab::WobbleSuppressorBase >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cvcapture_20_3e_1090',['shared_ptr< CvCapture >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20cvvideowriter_20_3e_1091',['shared_ptr< CvVideoWriter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20flann_3a_3aindex_20_3e_1092',['shared_ptr< flann::Index >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20flann_3a_3aindexparams_20_3e_1093',['shared_ptr< flann::IndexParams >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20flann_3a_3asearchparams_20_3e_1094',['shared_ptr< flann::SearchParams >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20gorigin_20_3e_1095',['shared_ptr< GOrigin >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20h264encoder_3a_3aencoderimpl_20_3e_1096',['shared_ptr< h264encoder::EncoderImpl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20imghashimpl_20_3e_1097',['shared_ptr< ImgHashImpl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20impl_20_3e_1098',['shared_ptr< Impl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20ivideocapture_20_3e_1099',['shared_ptr< IVideoCapture >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20ivideowriter_20_3e_1100',['shared_ptr< IVideoWriter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20priv_20_3e_1101',['shared_ptr< Priv >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20separatedetectionwork_20_3e_1102',['shared_ptr< SeparateDetectionWork >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['setp1_727',['setP1',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#ac5d2e5751dbfac3ed5bad4f1bc399c8f',1,'cv::stereo::StereoBinarySGBM::setP1()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ae62e17715deea97b431d328869a3eace',1,'cv::StereoSGBM::setP1()']]], + ['setp2_728',['setP2',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a11153c7094ae6e51c1073300f246672d',1,'cv::stereo::StereoBinarySGBM::setP2()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#a13a55a4704c988fa60e5f5902c4abfaa',1,'cv::StereoSGBM::setP2()']]], + ['setpanoconfidencethresh_729',['setPanoConfidenceThresh',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a6f5e62bc1dd5d7bdb5f9313a2c21c558',1,'cv::Stitcher']]], + ['setparam_730',['setParam',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#ab9e38d28672d35a8b59f7bffc2435400',1,'cv::dnn::Net']]], + ['setparameters_731',['setParameters',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a9d662e7707bc6d8fcc8e6cf687ec273a',1,'cv::DetectionBasedTracker']]], + ['setparams_732',['setParams',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1videostab_1_1GaussianMotionFilter.html#ab2d1ae14117e4368a949ccb247de0191',1,'cv::videostab::GaussianMotionFilter::setParams()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#ad85a6ee776c868979a087796d9b20576',1,'cv::tbm::ITrackerByMatching::setParams()']]], + ['setparamsfrom_733',['setParamsFrom',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#ad1bf1e5d77da2f75ea241e588c906177',1,'cv::dnn::Layer']]], + ['setpass2only_734',['setPass2Only',['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#aba564613ffdcd6a89ef0e381c4b02c48',1,'cv::MSER']]], + ['setpatchsize_735',['setPatchSize',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a644e7921b304c083ed93fcc199feb372',1,'cv::DISOpticalFlow::setPatchSize()'],['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a82b1719d6b194c37544675ffe48b093b',1,'cv::ORB::setPatchSize()']]], + ['setpatchstride_736',['setPatchStride',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a70fb84e13b487b3577e4ea3401839f23',1,'cv::DISOpticalFlow']]], + ['setpcaiterations_737',['setPCAIterations',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#adfe90881dab6a7f4d97d1def0ff1a829',1,'cv::ximgproc::AdaptiveManifoldFilter']]], + ['setperiod_738',['setPeriod',['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html#a7b31ec03811a5ec21a90604abcb7c2da',1,'cv::videostab::MoreAccurateMotionWobbleSuppressorBase']]], + ['setpivotthreshold_739',['setPivotThreshold',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#ac5aea9a81a8a567d32546b9d73af7fd4',1,'Eigen::SparseLU::setPivotThreshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a51206691317b0111955a71de3e76b814',1,'Eigen::SparseQR::setPivotThreshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#afd88c7631cf384fd5703bae4efacce3a',1,'Eigen::SPQR::setPivotThreshold()']]], + ['setplotaxiscolor_740',['setPlotAxisColor',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a6046c9d8b1e3ba7c4082cc7a7d052a5a',1,'cv::plot::Plot2d']]], + ['setplotbackgroundcolor_741',['setPlotBackgroundColor',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#af97ef3cc6652d466b5b18d4cd9f996e4',1,'cv::plot::Plot2d']]], + ['setplotgridcolor_742',['setPlotGridColor',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a3f86119235752f89f433c61570c8571f',1,'cv::plot::Plot2d']]], + ['setplotlinecolor_743',['setPlotLineColor',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#aca8001fc3ad93a6732f720e866864ee3',1,'cv::plot::Plot2d']]], + ['setplotlinewidth_744',['setPlotLineWidth',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a6ffabb76fae9da7a474412d13b3bb2fa',1,'cv::plot::Plot2d']]], + ['setplotsize_745',['setPlotSize',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a3d87ec313e06515e60b1d5cf96649978',1,'cv::plot::Plot2d']]], + ['setplottextcolor_746',['setPlotTextColor',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a6ba322fb5ed76865690cd58e35a9e436',1,'cv::plot::Plot2d']]], + ['setpointidxtoprint_747',['setPointIdxToPrint',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#ad2343ee63ec802f4526da6d21c06ac2b',1,'cv::plot::Plot2d']]], + ['setpolyn_748',['setPolyN',['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#a408c4f0d5b694dc815282b651a69d400',1,'cv::FarnebackOpticalFlow::setPolyN()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#a7052a5c87e886575630bb115e5bd2fa0',1,'cv::cuda::FarnebackOpticalFlow::setPolyN()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#abab8e4a57bbce5e223d626dbd6d96dba',1,'cv::superres::FarnebackOpticalFlow::setPolyN()']]], + ['setpolysigma_749',['setPolySigma',['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#a6aa97f512e1d8712480af3e8d89004a3',1,'cv::FarnebackOpticalFlow::setPolySigma()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#a2929e16965835a94c31c6836aa7c0688',1,'cv::cuda::FarnebackOpticalFlow::setPolySigma()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#a6e7e09bfb8c67413c8fc1a96ae270646',1,'cv::superres::FarnebackOpticalFlow::setPolySigma()']]], + ['setpose_750',['setPose',['https://docs.opencv.org/4.2.0/d9/d26/classcv_1_1viz_1_1Widget3D.html#a19f8b98423912d86deb35ded2cd62cca',1,'cv::viz::Widget3D']]], + ['setposthresh_751',['setPosThresh',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#af68ca3abf30a5d95b4f804806f2a3759',1,'cv::GeneralizedHoughGuil']]], + ['setprecision_752',['setprecision',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6e333ca9789cfa8a1f337434cee91957',1,'std']]], + ['setpreferablebackend_753',['setPreferableBackend',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a7f767df11386d39374db49cd8df8f59e',1,'cv::dnn::Net']]], + ['setpreferabletarget_754',['setPreferableTarget',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a9dddbefbc7f3defbe3eeb5dc3d3483f4',1,'cv::dnn::Net']]], + ['setprefiltercap_755',['setPreFilterCap',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a9bbfbab96761879a27f8f887afaf002a',1,'cv::stereo::StereoBinaryBM::setPreFilterCap()'],['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a1f04b0db5a5e2c5d21c49bf30d09e181',1,'cv::stereo::StereoBinarySGBM::setPreFilterCap()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#a19c6de399420337984db65aec28fc6b3',1,'cv::StereoBM::setPreFilterCap()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#a03019cccd79bcc833dd2423c55654975',1,'cv::StereoSGBM::setPreFilterCap()']]], + ['setprefiltersize_756',['setPreFilterSize',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#abba7b99050d33ad604c3b1a8d19f5de2',1,'cv::stereo::StereoBinaryBM::setPreFilterSize()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#a6edbcfd1dd79c9ba0c76a206741b4719',1,'cv::StereoBM::setPreFilterSize()']]], + ['setprefiltertype_757',['setPreFilterType',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a68e34fb48a39e3e3166a109899890e66',1,'cv::stereo::StereoBinaryBM::setPreFilterType()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#ae44e1b05ac1b36917cd5fb4d4fd1d7c2',1,'cv::StereoBM::setPreFilterType()']]], + ['setpriors_758',['setPriors',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a66756433f31db77a5511fc3f85403bd9',1,'cv::ml::DTrees']]], + ['setproducecelloutput_759',['setProduceCellOutput',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a593731630bfc7951471941018399cdb4',1,'cv::dnn::LSTMLayer']]], + ['setproducehiddenoutput_760',['setProduceHiddenOutput',['https://docs.opencv.org/4.2.0/dd/dfd/classcv_1_1dnn_1_1RNNLayer.html#a9f2270d30bb34a13b1c2c83aa16c3496',1,'cv::dnn::RNNLayer']]], + ['setprop_761',['setProp',['https://docs.opencv.org/4.2.0/dd/d02/structcv_1_1viz_1_1WidgetAccessor.html#acd4eaa43e67c2b55ec36a60e066fd8cb',1,'cv::viz::WidgetAccessor']]], + ['setpyramidscalefactor_762',['setPyramidScaleFactor',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#a9019efb36e28f9ea2ce420b1efcd010e',1,'cv::cuda::BroxOpticalFlow']]], + ['setpyrscale_763',['setPyrScale',['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#a3e9149ec5a74942b81959c198a13f1b3',1,'cv::FarnebackOpticalFlow::setPyrScale()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#a5421e1b742044a391972c1ccfa3a0896',1,'cv::cuda::FarnebackOpticalFlow::setPyrScale()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#a28a50b9759ce34e4a3cec42cd1460241',1,'cv::superres::FarnebackOpticalFlow::setPyrScale()']]], + ['setqualitylevel_764',['setQualityLevel',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#a55cb5f40d65ad96483f4d5667f932ec1',1,'cv::GFTTDetector']]], + ['setquantizationlevels_765',['setQuantizationLevels',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#abfbfb841e57ea94ccc189e10ca31051f',1,'cv::bgsegm::BackgroundSubtractorGMG::setQuantizationLevels()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a821679db06489d0ee8efe92a4716d89b',1,'cv::cuda::BackgroundSubtractorGMG::setQuantizationLevels()']]], + ['setradialbins_766',['setRadialBins',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a601bedc2ff38e281f6bcc34d7d59c0fa',1,'cv::ShapeContextDistanceExtractor']]], + ['setradius_767',['setRadius',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#aff114dc78cdafd537d14879de31ef16e',1,'cv::videostab::DeblurerBase::setRadius()'],['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#a969b637e1b400b21997537a8d55ec61a',1,'cv::cuda::DisparityBilateralFilter::setRadius()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#ae2bfdae38decac0507ae942294b686b8',1,'cv::videostab::InpainterBase::setRadius()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a5b13150e97832acd181c5f48b4dd536f',1,'cv::videostab::InpaintingPipeline::setRadius()'],['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html#a62d94c75cade902fd3b487b1ef9883fc',1,'cv::face::LBPHFaceRecognizer::setRadius()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a0245ba9e08329f9ac2f617a8f7c1eaaf',1,'cv::videostab::StabilizerBase::setRadius()']]], + ['setrandom_768',['setRandom',['https://docs.opencv.org/4.2.0/da/d27/classcv_1_1CalibrateDebevec.html#a9868cb53e5db7be83d7aed5220738643',1,'cv::CalibrateDebevec::setRandom()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac476e5852129ba32beaa1a8a3d7ee0db',1,'Eigen::DenseBase::setRandom()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac476e5852129ba32beaa1a8a3d7ee0db',1,'DenseBase< ArrayWrapper< ExpressionType > >::setRandom()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac476e5852129ba32beaa1a8a3d7ee0db',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::setRandom()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac476e5852129ba32beaa1a8a3d7ee0db',1,'DenseBase< Solve< Decomposition, RhsType > >::setRandom()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'Eigen::PlainObjectBase::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'Eigen::PlainObjectBase::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'Eigen::PlainObjectBase::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'Eigen::PlainObjectBase::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a5f0f6cc8039ed5ac026cd32ed5bbe6ea',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8921e8a7f9a5ea167231d29f8feb8700',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a66a2a4ffc386ca72214d0ac3161fdc03',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ae705648096d7e74b32daa82dd297dc54',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setRandom(Index rows, NoChange_t)']]], + ['setrangemaxval_769',['setRangeMaxVal',['https://docs.opencv.org/4.2.0/d4/d3b/classcv_1_1xphoto_1_1LearningBasedWB.html#a3d9395274be8053b2f09e46d11a24a65',1,'cv::xphoto::LearningBasedWB']]], + ['setrankproportion_770',['setRankProportion',['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1HausdorffDistanceExtractor.html#a36af13e0653ebb2d6677e68932010dfb',1,'cv::HausdorffDistanceExtractor']]], + ['setransacparams_771',['setRansacParams',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#a8926e08d617764a6e73250c2e4f8caaa',1,'cv::videostab::MotionEstimatorRansacL2::setRansacParams()'],['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a8fd42e55f57a3294ff6545c683e25e16',1,'cv::videostab::TranslationBasedLocalOutlierRejector::setRansacParams()']]], + ['setreconstructionoptions_772',['setReconstructionOptions',['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html#a25e8af5b84c3686ba329311e43600ae9',1,'cv::sfm::BaseSFM::setReconstructionOptions()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#a08cf4ba6ffcfcc78bf1f5b3006154172',1,'cv::sfm::SFMLibmvEuclideanReconstruction::setReconstructionOptions()']]], + ['setrect_773',['setRect',['https://docs.opencv.org/4.2.0/d1/d74/structHaarFeature64.html#a9881c5a424318d3e19570b464ac63659',1,'HaarFeature64']]], + ['setreductionratio_774',['setReductionRatio',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a91dfdf7c607b60f6ff27c4df1dc51f0e',1,'cv::line_descriptor::BinaryDescriptor']]], + ['setrefinementmask_775',['setRefinementMask',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#aa47bf2d3496b65b3e70b5b43681e5360',1,'cv::detail::BundleAdjusterBase']]], + ['setrefinemodels_776',['setRefineModels',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a38ecbadcbe486dc2fad2d2e2d3dc64b4',1,'cv::ximgproc::RICInterpolator']]], + ['setregistrationresol_777',['setRegistrationResol',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a9912fe8c095b8385267908e5ef707439',1,'cv::Stitcher']]], + ['setregressionaccuracy_778',['setRegressionAccuracy',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a936a3b56ccc5684f279dfd76bbea0247',1,'cv::ml::DTrees']]], + ['setregularization_779',['setRegularization',['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#abfe3f52c9e90a631b37baba63af21a49',1,'cv::ml::LogisticRegression']]], + ['setregularizationparameter_780',['setRegularizationParameter',['https://docs.opencv.org/4.2.0/dc/d18/classcv_1_1ThinPlateSplineShapeTransformer.html#ae163bbf29cafb9aa52c5e1cafdb7f4da',1,'cv::ThinPlateSplineShapeTransformer']]], + ['setrenderingproperty_781',['setRenderingProperty',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#af340fbe5b89aa3be57beb9fed91540a8',1,'cv::viz::Viz3d::setRenderingProperty()'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#af93f4866a4ceb8c3cdf6ab70bd5521ee',1,'cv::viz::Widget::setRenderingProperty()']]], + ['setrepresentation_782',['setRepresentation',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a0d42eeb4f71caa47ab2afbae5e5f496e',1,'cv::viz::Viz3d']]], + ['setrho_783',['setRho',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#a7c28b483669bf7286ac9356e36f78c1d',1,'cv::cuda::HoughLinesDetector::setRho()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html#ac3241f0ceb27843e66b060e79d98898c',1,'cv::cuda::HoughSegmentDetector::setRho()']]], + ['setricslictype_784',['setRICSLICType',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#aed741aab275fb1c2711108f33e526e64',1,'cv::optflow::DenseRLOFOpticalFlow']]], + ['setricspsize_785',['setRICSPSize',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#afc76edbc281509a88ad9f80e04f8ace8',1,'cv::optflow::DenseRLOFOpticalFlow']]], + ['setrightnodedesc_786',['setRightNodeDesc',['https://docs.opencv.org/4.2.0/de/db5/structHaarClassifierNode128.html#a86df27b22f7ed8f1f0158667344b4a7c',1,'HaarClassifierNode128']]], + ['setrlofopticalflowparameter_787',['setRLOFOpticalFlowParameter',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a2444cb65d35a640eb28f8978652b2342',1,'cv::optflow::DenseRLOFOpticalFlow::setRLOFOpticalFlowParameter()'],['https://docs.opencv.org/4.2.0/df/dc4/classcv_1_1optflow_1_1SparseRLOFOpticalFlow.html#ae438345e3d2b55f30301f0057356a03d',1,'cv::optflow::SparseRLOFOpticalFlow::setRLOFOpticalFlowParameter()']]], + ['setrngseed_788',['setRNGSeed',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga757e657c037410d9e19e819569e7de0f',1,'cv::setRNGSeed()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga757e657c037410d9e19e819569e7de0f',1,'setRNGSeed()(Global Namespace)']]], + ['setroi1_789',['setROI1',['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#a4bc3beb14fb5db0d58533fa101de20a2',1,'cv::StereoBM']]], + ['setroi2_790',['setROI2',['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#ae4b5129722296e505bfba9fac46d43a2',1,'cv::StereoBM']]], + ['setrotationinvariant_791',['setRotationInvariant',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#aac3054da68894dbbac9ed6801eb50d32',1,'cv::ShapeContextDistanceExtractor']]], + ['setrows_792',['setRows',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a775e26ae9b7366049163df909b4fb064',1,'cv::rgbd::RgbdNormals']]], + ['setrpropdw0_793',['setRpropDW0',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ae32498b59f9b8ce5737006ad49ad863e',1,'cv::ml::ANN_MLP']]], + ['setrpropdwmax_794',['setRpropDWMax',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a09d58b45d950729587577de3a7ed7142',1,'cv::ml::ANN_MLP']]], + ['setrpropdwmin_795',['setRpropDWMin',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a2d1c40a8eae6c7ad25554593a11d1e80',1,'cv::ml::ANN_MLP']]], + ['setrpropdwminus_796',['setRpropDWMinus',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a65350ee4fbb0e521e3d53dbd3101dadd',1,'cv::ml::ANN_MLP']]], + ['setrpropdwplus_797',['setRpropDWPlus',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a54b72c0446330effe6a003929d4aecbe',1,'cv::ml::ANN_MLP']]], + ['setsampleroi_798',['setSampleROI',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a154e3dd2a6584f00107f9f314302a822',1,'cv::TrackerStateEstimatorAdaBoosting']]], + ['setsamples_799',['setSamples',['https://docs.opencv.org/4.2.0/da/d27/classcv_1_1CalibrateDebevec.html#a2296f94b849dd9abe06ef285e446d439',1,'cv::CalibrateDebevec']]], + ['setsamplingpoints_800',['setSamplingPoints',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a04adf50e23489c41975a6b7524c189d4',1,'cv::xfeatures2d::PCTSignatures']]], + ['setsaturation_801',['setSaturation',['https://docs.opencv.org/4.2.0/da/d53/classcv_1_1TonemapDrago.html#aac3b1ea8fb3d8c4bf14786c57e73ba78',1,'cv::TonemapDrago::setSaturation()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga9c7de9517f95fd046910fc818e256d55',1,'cv::xphoto::TonemapDurand::setSaturation()'],['https://docs.opencv.org/4.2.0/de/d76/classcv_1_1TonemapMantiuk.html#a9313da874ede9561f23013d3dacc5292',1,'cv::TonemapMantiuk::setSaturation()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga9c7de9517f95fd046910fc818e256d55',1,'setSaturation()(Global Namespace)']]], + ['setsaturationthreshold_802',['setSaturationThreshold',['https://docs.opencv.org/4.2.0/d7/d71/classcv_1_1xphoto_1_1GrayworldWB.html#ac6e17766e394adc15588b8522202cc71',1,'cv::xphoto::GrayworldWB::setSaturationThreshold()'],['https://docs.opencv.org/4.2.0/d4/d3b/classcv_1_1xphoto_1_1LearningBasedWB.html#a9bff5a507d4dffc58e16d85b1d07f35f',1,'cv::xphoto::LearningBasedWB::setSaturationThreshold()']]], + ['setsaturationweight_803',['setSaturationWeight',['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html#a5b0db42a20974ec512a7722e8fa6c92a',1,'cv::MergeMertens']]], + ['setscale_804',['setScale',['https://docs.opencv.org/4.2.0/d5/d76/classcv_1_1PyRotationWarper.html#a90b000bb75f95294f9b0b6ec9859eb55',1,'cv::PyRotationWarper::setScale()'],['https://docs.opencv.org/4.2.0/da/db8/classcv_1_1detail_1_1RotationWarper.html#a04686ebbe20736e23702e43ec0acf074',1,'cv::detail::RotationWarper::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'cv::detail::RotationWarperBase::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< CompressedRectilinearPortraitProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< CompressedRectilinearProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< CylindricalPortraitProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< CylindricalProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< FisheyeProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< MercatorProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< PaniniPortraitProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< PaniniProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< PlanePortraitProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< PlaneProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< SphericalPortraitProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< SphericalProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< StereographicProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a01b400d3384b6767332a5c8b795372b3',1,'RotationWarperBase< TransverseMercatorProjector >::setScale()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a00f559b0f66b86a44de84a08527919c2',1,'cv::superres::SuperResolution::setScale()'],['https://docs.opencv.org/4.2.0/de/d76/classcv_1_1TonemapMantiuk.html#a5b4522c68f77cd622e75c32ff52fc637',1,'cv::TonemapMantiuk::setScale()']]], + ['setscalefactor_805',['setScaleFactor',['https://docs.opencv.org/4.2.0/d1/dfd/classcv_1_1xfeatures2d_1_1BoostDesc.html#aafc23cbcf6ad22396ea49e776288577e',1,'cv::xfeatures2d::BoostDesc::setScaleFactor()'],['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html#a26e9db5400a767bee098cfaf518e15f3',1,'cv::superres::BroxOpticalFlow::setScaleFactor()'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a0900d85125de1fa488c883e56547e351',1,'cv::cuda::CascadeClassifier::setScaleFactor()'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a21dc5e3dc6272030694d52e83352b337',1,'cv::cuda::HOG::setScaleFactor()'],['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#a9f11f963c44fb96531595cbbca220730',1,'cv::DetectionBasedTracker::IDetector::setScaleFactor()'],['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a9d7bd07408d3a5cd884ccff61df01092',1,'cv::ORB::setScaleFactor()'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html#aac2721395d08d43418bf4459e2222878',1,'cv::xfeatures2d::VGG::setScaleFactor()']]], + ['setscalesnumber_806',['setScalesNumber',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a1cb192031548638c254e086bc7d6e896',1,'cv::optflow::DualTVL1OpticalFlow::setScalesNumber()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#a44f95554a5a05f2b413320fbfc4d0810',1,'cv::superres::DualTVL1OpticalFlow::setScalesNumber()']]], + ['setscalestep_807',['setScaleStep',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#acec9624d8c84ec6408f8c389c4db5c8c',1,'cv::optflow::DualTVL1OpticalFlow::setScaleStep()'],['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a745e781d3341b320e1b23504482cd3ae',1,'cv::GeneralizedHoughGuil::setScaleStep()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#ad9a69e01db9833117a50365976b2f803',1,'cv::cuda::OpticalFlowDual_TVL1::setScaleStep()']]], + ['setscalethresh_808',['setScaleThresh',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a25fb2540b6ac5383c33fad5c3677eaeb',1,'cv::GeneralizedHoughGuil']]], + ['setscallefactor_809',['setScalleFactor',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a20d9b0120ffa97f780f7b580fd623df2',1,'cv::stereo::StereoBinaryBM']]], + ['setscallingfactor_810',['setScallingFactor',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#ad8f2f8256df95438f8d0f77aafc8e122',1,'cv::stereo::Matching']]], + ['setscoretype_811',['setScoreType',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a9ab0540195ab49f9e58db065bf38e783',1,'cv::ORB']]], + ['setseamestimationresol_812',['setSeamEstimationResol',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad0fcef52b2fedda1dbb90ea780cd7979',1,'cv::Stitcher']]], + ['setseamfinder_813',['setSeamFinder',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad813cf8a3493fa6fe53343f3f5a1da81',1,'cv::Stitcher']]], + ['setsearchparams_814',['setSearchParams',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#ad6ee0fb868c7b97bb967f0ccb7ed1e1b',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['setsegegbthresholdi_815',['setSegEgbThresholdI',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#a0eff2a2f17a1262f6b9f3271695f071b',1,'cv::hfs::HfsSegment']]], + ['setsegegbthresholdii_816',['setSegEgbThresholdII',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#aa0ea696e91819ee3706f8353b07d5cb0',1,'cv::hfs::HfsSegment']]], + ['setsensitivity_817',['setSensitivity',['https://docs.opencv.org/4.2.0/df/d5b/classcv_1_1videostab_1_1WeightingDeblurer.html#ac928392260915d897cc26ea0d1f590b3',1,'cv::videostab::WeightingDeblurer']]], + ['setsensorerrora_818',['setSensorErrorA',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a1e18620cab2408fb23c611675bd5e3a1',1,'cv::rgbd::RgbdPlane']]], + ['setsensorerrorb_819',['setSensorErrorB',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a75a7438acda400bab1cb94116b9d1b55',1,'cv::rgbd::RgbdPlane']]], + ['setsensorerrorc_820',['setSensorErrorC',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a13d9895015125131e4e76c717228d657',1,'cv::rgbd::RgbdPlane']]], + ['setservopos_821',['setServoPos',['../namespacecan_1_1motor.html#af3d8be6908d1f8cf8e961face650b1d8',1,'can::motor']]], + ['setshadowthreshold_822',['setShadowThreshold',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#a85efc41f5e3e7f7ca2c92245829043c0',1,'cv::BackgroundSubtractorKNN::setShadowThreshold()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a1e9f50c4bf60b77ca12a6977ccdd08cb',1,'cv::BackgroundSubtractorMOG2::setShadowThreshold()']]], + ['setshadowvalue_823',['setShadowValue',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html#a5a4d993edba38be565198098bcc40004',1,'cv::BackgroundSubtractorKNN::setShadowValue()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a259029f0eefe5ade47d98d744e829f8a',1,'cv::BackgroundSubtractorMOG2::setShadowValue()']]], + ['setshapecontextweight_824',['setShapeContextWeight',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#ac9ea3a1ce4a9e8767acef0a48a7cf8d6',1,'cv::ShapeContextDistanceExtractor']]], + ['setsharpness_825',['setSharpness',['https://docs.opencv.org/4.2.0/d4/d69/classcv_1_1detail_1_1FeatherBlender.html#aa4c09de778a01cdad7af1aabc443b279',1,'cv::detail::FeatherBlender']]], + ['setshift_826',['setShift',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a886fc102723ca7bde4ac7162dfd72f5d',1,'Eigen::CholmodBase::setShift()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a886fc102723ca7bde4ac7162dfd72f5d',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::setShift()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a886fc102723ca7bde4ac7162dfd72f5d',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::setShift()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a886fc102723ca7bde4ac7162dfd72f5d',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::setShift()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a886fc102723ca7bde4ac7162dfd72f5d',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::setShift()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#a2d8d996ce1085fd977850988735739f0',1,'Eigen::HouseholderSequence::setShift()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html#a362352f755101faaac59c1ed9d5e3559',1,'Eigen::SimplicialCholeskyBase::setShift()']]], + ['setshowgrid_827',['setShowGrid',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a28f5f0df1cce34ee6a0b284d7d3f918f',1,'cv::plot::Plot2d']]], + ['setshowtext_828',['setShowText',['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a16493b970b305e0cfc7f40e3a352b67c',1,'cv::plot::Plot2d']]], + ['setsigma_829',['setSigma',['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#aaf401f1032d09910d6851602a3eeed9a',1,'cv::ximgproc::EdgeAwareInterpolator::setSigma()'],['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1ximgproc_1_1segmentation_1_1GraphSegmentation.html#a35bb2fc02d255a7ba81e2de0c0045562',1,'cv::ximgproc::segmentation::GraphSegmentation::setSigma()'],['https://docs.opencv.org/4.2.0/d5/d97/classcv_1_1img__hash_1_1RadialVarianceHash.html#a220ddf8070bf024ef24d23a14d41b9b7',1,'cv::img_hash::RadialVarianceHash::setSigma()'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html#ae130afee934e62a91e5aa29a5feb572c',1,'cv::xfeatures2d::VGG::setSigma()']]], + ['setsigmacolor_830',['setSigmaColor',['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1ximgproc_1_1DisparityWLSFilter.html#a7a3acad02148e8acc581acf6ac3607e5',1,'cv::ximgproc::DisparityWLSFilter::setSigmaColor()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga7dec866735ecbae9e05224958d4585fd',1,'cv::xphoto::TonemapDurand::setSigmaColor()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga7dec866735ecbae9e05224958d4585fd',1,'setSigmaColor()(Global Namespace)']]], + ['setsigmadepth_831',['setSigmaDepth',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#afec3584bcd59b435c38a0062b93c49f4',1,'cv::rgbd::FastICPOdometry']]], + ['setsigmar_832',['setSigmaR',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a67aa879366edccb36bf7ae3be51de9cd',1,'cv::ximgproc::AdaptiveManifoldFilter']]], + ['setsigmarange_833',['setSigmaRange',['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#a1754bd4c0471bd54d875bfc1fb5db409',1,'cv::cuda::DisparityBilateralFilter']]], + ['setsigmas_834',['setSigmaS',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a18fc413287d3dbceb2885d47a9811ff3',1,'cv::ximgproc::AdaptiveManifoldFilter']]], + ['setsigmaspace_835',['setSigmaSpace',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga8869068912fae078699ce931bdc17fc4',1,'cv::xphoto::TonemapDurand::setSigmaSpace()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga8869068912fae078699ce931bdc17fc4',1,'setSigmaSpace()(Global Namespace)']]], + ['setsigmaspatial_836',['setSigmaSpatial',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a6aa58e36d51ec85b5f81ff5778f11629',1,'cv::rgbd::FastICPOdometry']]], + ['setsign_837',['setSign',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga939dba50e8cd4c484e9ab95955d1d07a',1,'cv::softdouble::setSign()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga24ffde1fd1ffbdfee1c033491829cbf7',1,'cv::softfloat::setSign()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga24ffde1fd1ffbdfee1c033491829cbf7',1,'setSign()(Global Namespace)']]], + ['setsize_838',['setSize',['https://docs.opencv.org/4.2.0/d7/d3d/classcv_1_1viz_1_1WImage3D.html#aa8368e3dfed3f8d563297743f9791828',1,'cv::viz::WImage3D']]], + ['setslicspixelsize_839',['setSlicSpixelSize',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#a5affbf9b56a7b0189c4a4f2988df373e',1,'cv::hfs::HfsSegment']]], + ['setsmallerblocksize_840',['setSmallerBlockSize',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#ada787b8648754270796ecc494f1bd584',1,'cv::stereo::StereoBinaryBM::setSmallerBlockSize()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#abb6280255bb070f51ade69d6455216d6',1,'cv::StereoBM::setSmallerBlockSize()']]], + ['setsmallwinsize_841',['setSmallWinSize',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#adf7cf2f4c4b8bf95567b9e856eaeff1c',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['setsmoothingradius_842',['setSmoothingRadius',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a5ffcc3e992b4c99e980978c7554c3ba4',1,'cv::bgsegm::BackgroundSubtractorGMG::setSmoothingRadius()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#ad43b819ade1c5e1900e16bc2e5d17f5a',1,'cv::cuda::BackgroundSubtractorGMG::setSmoothingRadius()']]], + ['setsolveriterations_843',['setSolverIterations',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#a7e714aba53c5947ccc58e04f818d028b',1,'cv::cuda::BroxOpticalFlow::setSolverIterations()'],['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html#af4676086227bd01c01a6ae1049c75ed9',1,'cv::superres::BroxOpticalFlow::setSolverIterations()']]], + ['setsolvertype_844',['setSolverType',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a8beec2719d217a845ce3f0299e4eefc5',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['setsoriterations_845',['setSorIterations',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#a559b86acd9e6f504e34bf475cb70d049',1,'cv::VariationalRefinement']]], + ['setsource_846',['setSource',['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#a20f82ac711832fec1b2be70e7a3785de',1,'cv::GStreamingCompiled::setSource(GRunArgs &&ins)'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#a534f08e6a1438455d38571025bbf321c',1,'cv::GStreamingCompiled::setSource(const gapi::wip::IStreamSource::Ptr &s)']]], + ['setspatialweight_847',['setSpatialWeight',['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#aa3813a0d299c006d1d7f6bcae7e54cd7',1,'cv::hfs::HfsSegment']]], + ['setspecklerange_848',['setSpeckleRange',['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#a3c9106923f87592b98bf53e90bcba020',1,'cv::StereoMatcher::setSpeckleRange()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#a9f2f1d87e19dfb3ca82fc9479281a9b3',1,'cv::stereo::StereoMatcher::setSpeckleRange()']]], + ['setspecklewindowsize_849',['setSpeckleWindowSize',['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#ad21033d76ad7cdf36a5c8bb6cd946d43',1,'cv::StereoMatcher::setSpeckleWindowSize()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#a792415b3f9a46dd49a81eb4874d2ced5',1,'cv::stereo::StereoMatcher::setSpeckleWindowSize()']]], + ['setspekleremovaltechnique_850',['setSpekleRemovalTechnique',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#af7e3dccf3b17eb65cf3e0799330e9d27',1,'cv::stereo::StereoBinaryBM::setSpekleRemovalTechnique()'],['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#aeeb346eebf5f305f591b141745b9cff1',1,'cv::stereo::StereoBinarySGBM::setSpekleRemovalTechnique()']]], + ['setsplitnumber_851',['setSplitNumber',['https://docs.opencv.org/4.2.0/d9/dfa/classcv_1_1freetype_1_1FreeType2.html#a572143e6c68eab181387d9f4b3366f8b',1,'cv::freetype::FreeType2']]], + ['setspqrordering_852',['setSPQROrdering',['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a7f0fa283af9cb2114f55a84a134cd603',1,'Eigen::SPQR']]], + ['setstabilizationmotions_853',['setStabilizationMotions',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a68bc03d322d17c9de5bf443b288070e7',1,'cv::videostab::InpainterBase::setStabilizationMotions()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a8010bbd57f273de4a6054513d321c326',1,'cv::videostab::InpaintingPipeline::setStabilizationMotions()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a2a2fc2428a977a015135e9c5d283b366',1,'cv::videostab::WobbleSuppressorBase::setStabilizationMotions()']]], + ['setstabilizedframes_854',['setStabilizedFrames',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#af358007841909b089eb568ac9eb76a79',1,'cv::videostab::InpainterBase::setStabilizedFrames()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#ade99b46eb80ad9db0b7d9d9a0ceb03e3',1,'cv::videostab::InpaintingPipeline::setStabilizedFrames()']]], + ['setstagethreshold_855',['setStageThreshold',['https://docs.opencv.org/4.2.0/d5/d37/structHaarStage64.html#a8ef83f1f3b12e6b9e99b7cbe78986a8a',1,'HaarStage64']]], + ['setstartclassifierrootnodeoffset_856',['setStartClassifierRootNodeOffset',['https://docs.opencv.org/4.2.0/d5/d37/structHaarStage64.html#a8e4a8efe43f64b9a87ad257830c8b412',1,'HaarStage64']]], + ['setstate_857',['setState',['../classcommands_1_1DriveToWaypointCommand.html#a19c20926c6c26f6196d744b5fe51bf07',1,'commands::DriveToWaypointCommand']]], + ['setstate_858',['setstate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'basic_ios< char, _Traits >::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'basic_iostream< char >::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'basic_istream< char >::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'basic_istream< char, _Traits >::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'basic_ostream< char >::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'basic_ostream< char, _Traits >::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_fstream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_ifstream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_ios::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_iostream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_istream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_istringstream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_ofstream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_ostream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_ostringstream::setstate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2da7d3305cba0695b1d1bec916ae64b0',1,'std::basic_stringstream::setstate()']]], + ['setstddev_859',['setStdDev',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a655e0cfadf3ca8e2acac038132841183',1,'cv::ShapeContextDistanceExtractor']]], + ['setstdevthresh_860',['setStdevThresh',['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1videostab_1_1ConsistentMosaicInpainter.html#a08f47e6b4674029d42a823e2a8243312',1,'cv::videostab::ConsistentMosaicInpainter']]], + ['setstepdecreasingpower_861',['setStepDecreasingPower',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a681aa5262a86ff0c00c88c5e4dc5f72b',1,'cv::ml::SVMSGD']]], + ['setsubpixelinterpolationmethod_862',['setSubPixelInterpolationMethod',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a575ba986f8ec336f79770d661a65a109',1,'cv::stereo::StereoBinarySGBM']]], + ['setsuperpixelmode_863',['setSuperpixelMode',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a43844b484f6125722b92d67c14cc589e',1,'cv::ximgproc::RICInterpolator']]], + ['setsuperpixelnncnt_864',['setSuperpixelNNCnt',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a315155e5596bd3680f92042399c7b296',1,'cv::ximgproc::RICInterpolator']]], + ['setsuperpixelruler_865',['setSuperpixelRuler',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#ace5cc4443ca08d80238ac85c6b819bdf',1,'cv::ximgproc::RICInterpolator']]], + ['setsuperpixelsize_866',['setSuperpixelSize',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a1ffa08f77ec237ed825c7446517b1bc1',1,'cv::ximgproc::RICInterpolator']]], + ['setsupportregiontype_867',['setSupportRegionType',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a0ee496677b285aa6ee610a1a0126e290',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['setsvmdetector_868',['setSVMDetector',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a5d12db2277b7c3c849d75258eec8d1d4',1,'cv::cuda::HOG::setSVMDetector()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a6de5ac55631eed51e36278cde3a2c159',1,'cv::HOGDescriptor::setSVMDetector()']]], + ['setsvmsgdtype_869',['setSvmsgdType',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#ae0c76a4387f722444128f206ba4dd0fc',1,'cv::ml::SVMSGD']]], + ['settarget_870',['setTarget',['../classcontrol_1_1JacobianPosController.html#a4b44e413b357ec7dff699bee889ffdc8',1,'control::JacobianPosController::setTarget()'],['../classJacobianVelController.html#a7f61cef5d0a88d9125b6e50d7138afb6',1,'JacobianVelController::setTarget()'],['../classcontrol_1_1PIDController.html#a7203448f24fe7ba0c158a436cb4552ac',1,'control::PIDController::setTarget()'],['../classcontrol_1_1TrapezoidalVelocityProfile.html#ae31a956ee6518a948f64280178820094',1,'control::TrapezoidalVelocityProfile::setTarget(robot::types::datatime_t currTime, const std::array< double, dim > &startPos, const std::array< double, dim > &endPos)'],['../classcontrol_1_1TrapezoidalVelocityProfile.html#a0c8c7025b9622eabcb93aada375d3c76',1,'control::TrapezoidalVelocityProfile::setTarget(robot::types::datatime_t currTime, const navtypes::Vectord< dim > &startPos, const navtypes::Vectord< dim > &endPos)'],['../classcontrol_1_1SingleDimTrapezoidalVelocityProfile.html#a284b9cbf9248912e221c6b0a0b93ef46',1,'control::SingleDimTrapezoidalVelocityProfile::setTarget()']]], + ['settargetfg_871',['setTargetFg',['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html#a26ae67f12c55b20a89df448400cee1fc',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerAdaBoostingTargetState::setTargetFg()'],['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html#a0e5d189b5da55a6ac1c752957e2ac304',1,'cv::TrackerStateEstimatorMILBoosting::TrackerMILTargetState::setTargetFg()']]], + ['settargetheight_872',['setTargetHeight',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html#a5263838c2c5b321dada6202e4074ecea',1,'cv::TrackerTargetState']]], + ['settargetposition_873',['setTargetPosition',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html#acf8ce8de65e1702e9862bbf6d1ea6a38',1,'cv::TrackerTargetState']]], + ['settargetresponses_874',['setTargetResponses',['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html#ad54b830d495e2a8a6cd2b99672f75fc6',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerAdaBoostingTargetState']]], + ['settargetwidth_875',['setTargetWidth',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html#a6b9f6a9b2fdbb4d40205b2479386ef0f',1,'cv::TrackerTargetState']]], + ['settau_876',['setTau',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a3987aefe9ac162918d14dc3d94a291ff',1,'cv::optflow::DualTVL1OpticalFlow::setTau()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#ab2d2d6aca00036be8365b83986c293e8',1,'cv::superres::DualTVL1OpticalFlow::setTau()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#ae06f0c80c4250311b730341c5d622f78',1,'cv::cuda::OpticalFlowDual_TVL1::setTau()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a6159d14059c785f82cf489546fe8c233',1,'cv::superres::SuperResolution::setTau()']]], + ['settemplate_877',['setTemplate',['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#ad37bc75bf3054590d10f99cf608f10d5',1,'cv::GeneralizedHough::setTemplate(InputArray templ, Point templCenter=Point(-1, -1))=0'],['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a923534894a0f23563289abcd6cbe74d3',1,'cv::GeneralizedHough::setTemplate(InputArray edges, InputArray dx, InputArray dy, Point templCenter=Point(-1, -1))=0']]], + ['settemporalarearadius_878',['setTemporalAreaRadius',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a28022e488e09fb69f62345b2ca9545e5',1,'cv::superres::SuperResolution']]], + ['settermcriteria_879',['setTermCriteria',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ab6310aa2b5894ceb4e72008e62316182',1,'cv::ml::ANN_MLP::setTermCriteria()'],['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#ae81349da624b7fa2b76eba78b2ffa613',1,'cv::detail::BundleAdjusterBase::setTermCriteria()'],['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ab516e6f125bd4ebc976306e956320313',1,'cv::ml::EM::setTermCriteria()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#acc0490ba09a6dcc3c546d38345490e4b',1,'cv::ml::LogisticRegression::setTermCriteria()'],['https://docs.opencv.org/4.2.0/df/d11/classcv_1_1MinProblemSolver.html#aad56ae718e6cde978cac28e6ae1d58e7',1,'cv::MinProblemSolver::setTermCriteria()'],['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html#a6fb8be4c0c490a5b9ff870adce1a0f20',1,'cv::ml::RTrees::setTermCriteria()'],['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html#a68ffa532d3ebfad03d9473633372633c',1,'cv::SparsePyrLKOpticalFlow::setTermCriteria()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a6a86483c5518c332fedf6ec381a1daa7',1,'cv::ml::SVM::setTermCriteria()'],['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#abf9c385dd82c06d6862c0c2aa62e4efc',1,'cv::ml::SVMSGD::setTermCriteria()']]], + ['settexcoordarray_880',['setTexCoordArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a3bdfb171222d5e7802de3a7c29984fd5',1,'cv::ogl::Arrays']]], + ['settext_881',['setText',['https://docs.opencv.org/4.2.0/de/d0b/classcv_1_1viz_1_1WText.html#ab3c0726018bd632a006c38a1e16b8254',1,'cv::viz::WText::setText()'],['https://docs.opencv.org/4.2.0/d6/d3d/classcv_1_1viz_1_1WText3D.html#a3a18f3dece7c214bbec42593e6a77e7f',1,'cv::viz::WText3D::setText()']]], + ['settexturethreshold_882',['setTextureThreshold',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a640a3cfbd15903dbd7a8622897e4f0c8',1,'cv::stereo::StereoBinaryBM::setTextureThreshold()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#aaee69730b91d606744cc4c5d9d8590e7',1,'cv::StereoBM::setTextureThreshold()']]], + ['settheta_883',['setTheta',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#abbf4d691ccdbe65e6fbdf9b9b3e9305c',1,'cv::optflow::DualTVL1OpticalFlow::setTheta()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#a5cac2c52b3a25953c106325a49f1dbd3',1,'cv::superres::DualTVL1OpticalFlow::setTheta()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#aea12c3df9963eb3a28cdcb81f1018252',1,'cv::cuda::HoughLinesDetector::setTheta()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html#a437ed5509bed40cd17a187e8133058ee',1,'cv::cuda::HoughSegmentDetector::setTheta()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#adcad8d9aeda533fcd49bba4fec924327',1,'cv::cuda::OpticalFlowDual_TVL1::setTheta()']]], + ['setthreshold_884',['setThreshold',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#a0441b248a0567f553a03a857b681f482',1,'cv::AgastFeatureDetector::setThreshold()'],['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#aaeec869ae038190ffac3f38174058b25',1,'cv::AKAZE::setThreshold()'],['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html#a5b9e5e5ee62922e6a3f6cec8110eef26',1,'cv::face::BasicFaceRecognizer::setThreshold()'],['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html#a29e10df2eaef71f2ae3b7183ee3e915a',1,'cv::BRISK::setThreshold()'],['https://docs.opencv.org/4.2.0/d3/d30/classcv_1_1CalibrateRobertson.html#a751f087a7b571130daab29b0fdd6a363',1,'cv::CalibrateRobertson::setThreshold()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#a3182081e5f8023e658ad8ab96656dd63',1,'cv::face::FaceRecognizer::setThreshold()'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a63a6cd2ace658f53f235fe3082104db4',1,'cv::FastFeatureDetector::setThreshold()'],['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#a36ee602f0b43664a1d3369a06eea087c',1,'cv::cuda::FastFeatureDetector::setThreshold()'],['https://docs.opencv.org/4.2.0/de/db5/structHaarClassifierNode128.html#a9219b271e971cd7ae812a3bc98d509ca',1,'HaarClassifierNode128::setThreshold()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#aa962c928a4eeaa619215a318f8dddfc6',1,'cv::cuda::HoughLinesDetector::setThreshold()'],['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#ae338d672a3f1531c9862a410dbdafe69',1,'cv::KAZE::setThreshold()'],['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html#a4b4903dcfaa98192784a41b299360b5c',1,'cv::face::LBPHFaceRecognizer::setThreshold()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#ac600504802956872d403d5ecd20d19ba',1,'cv::rgbd::RgbdPlane::setThreshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ae712cdc9f0e521cfc8061bee58ff55ee',1,'Eigen::ColPivHouseholderQR::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a648df14c457ceceb09d933d06d3bdded',1,'Eigen::ColPivHouseholderQR::setThreshold(Default_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ae712cdc9f0e521cfc8061bee58ff55ee',1,'ColPivHouseholderQR< MatrixType >::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a648df14c457ceceb09d933d06d3bdded',1,'ColPivHouseholderQR< MatrixType >::setThreshold(Default_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#aa9c9f7cbde9d58ca5552381b70ad8d82',1,'Eigen::CompleteOrthogonalDecomposition::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a27c8da71874be7a64d6723bd0cae9f4f',1,'Eigen::CompleteOrthogonalDecomposition::setThreshold(Default_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a92277e572bf98245891015d12dd2b602',1,'Eigen::FullPivHouseholderQR::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aaea4bf3dd145e0cddb16e364cca9d887',1,'Eigen::FullPivHouseholderQR::setThreshold(Default_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a414592d82de98f5bd075965caf56d681',1,'Eigen::FullPivLU::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a1b5e30add3dfb6625da1213d68418f44',1,'Eigen::FullPivLU::setThreshold(Default_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a1c95d05398fc15e410a28560ef70a5a6',1,'Eigen::SVDBase::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a27586b69dbfb63f714d1d45fd6304f97',1,'Eigen::SVDBase::setThreshold(Default_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a1c95d05398fc15e410a28560ef70a5a6',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::setThreshold(const RealScalar &threshold)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a27586b69dbfb63f714d1d45fd6304f97',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::setThreshold(Default_t)']]], + ['setthresholddelta_885',['setThresholdDelta',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html#a7263e051dad91476efdd1d8b57fb11d8',1,'cv::text::ERFilter']]], + ['settilesgridsize_886',['setTilesGridSize',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1CLAHE.html#a3b96ad7aa2dbea70310d74d717bc5c65',1,'cv::CLAHE']]], + ['settings_2eh_887',['settings.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00968.html',1,'']]], + ['setto_888',['setTo',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a5a519caf215925ff10f4286c018905bf',1,'cv::_OutputArray::setTo()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ab263999dea4f7f28d4dd4ced6d2e970b',1,'cv::cuda::GpuMat::setTo(Scalar s)'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#aa155961a4c8c19bdb2c9b1886e45ce9a',1,'cv::cuda::GpuMat::setTo(Scalar s, Stream &stream)'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a16cb9be32213df86f3b55ec131abff70',1,'cv::cuda::GpuMat::setTo(Scalar s, InputArray mask)'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a1090e7ff25e23cf6243809e9a031b51d',1,'cv::cuda::GpuMat::setTo(Scalar s, InputArray mask, Stream &stream)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a0440e2a164c0b0d8462fb1e487be9876',1,'cv::Mat::setTo()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a57513848cc5e55fe2b40bf98dfc99f08',1,'cv::UMat::setTo()']]], + ['settolerance_889',['setTolerance',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#ac160a444af8998f93da9aa30e858470d',1,'Eigen::IterativeSolverBase']]], + ['settrackbarmax_890',['setTrackbarMax',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga7e5437ccba37f1154b65210902fc4480',1,'cv::setTrackbarMax()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga7e5437ccba37f1154b65210902fc4480',1,'setTrackbarMax()(Global Namespace)']]], + ['settrackbarmin_891',['setTrackbarMin',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gabe26ffe8d2b60cc678895595a581b7aa',1,'cv::setTrackbarMin()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gabe26ffe8d2b60cc678895595a581b7aa',1,'setTrackbarMin()(Global Namespace)']]], + ['settrackbarpos_892',['setTrackbarPos',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga67d73c4c9430f13481fd58410d01bd8d',1,'cv::setTrackbarPos()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga67d73c4c9430f13481fd58410d01bd8d',1,'setTrackbarPos()(Global Namespace)']]], + ['settrackerstateestimator_893',['setTrackerStateEstimator',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#afe3cf67b96f53b3e38c67c99856e01d6',1,'cv::TrackerModel']]], + ['settrainingpath_894',['setTrainingPath',['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#aa7f1fc8b9265e355babe73d68d7ca833',1,'cv::saliency::ObjectnessBING']]], + ['settrainmethod_895',['setTrainMethod',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a4be093cfd2e743ee2f41e34e50cf3a54',1,'cv::ml::ANN_MLP::setTrainMethod()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#a18934b829da316ac02d18d5a413ab221',1,'cv::ml::LogisticRegression::setTrainMethod()']]], + ['settraintestsplit_896',['setTrainTestSplit',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#ab444173f4d980bb3c18d856df706c920',1,'cv::ml::TrainData']]], + ['settraintestsplitratio_897',['setTrainTestSplitRatio',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#ad59c8df14e133ba492ff5cbfa21244cc',1,'cv::ml::TrainData']]], + ['settransformalgorithm_898',['setTransformAlgorithm',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html#a537e77faeb22ad21db4c3a45084019ef',1,'cv::ShapeContextDistanceExtractor']]], + ['settransformtype_899',['setTransformType',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a27faa00de58fa54759c392b7a09464fd',1,'cv::rgbd::FastICPOdometry::setTransformType()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a702746d52b26e5803d97e4344389ff26',1,'cv::rgbd::ICPOdometry::setTransformType()'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a8b4b267ab88b06d85cd394a84553181d',1,'cv::rgbd::Odometry::setTransformType()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#ae8d72a324b7f629020000cadde08beef',1,'cv::rgbd::RgbdICPOdometry::setTransformType()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#aa0da99e19e5a13313df45e088ae73007',1,'cv::rgbd::RgbdOdometry::setTransformType()']]], + ['settranslation_900',['setTranslation',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a326cff067288459c6fefa0f3fe313a14',1,'cv::xfeatures2d::PCTSignatures']]], + ['settranslations_901',['setTranslations',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a48a29104ac014ba9adc426ec67568ed7',1,'cv::xfeatures2d::PCTSignatures']]], + ['settreeheight_902',['setTreeHeight',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a2ebe97b627b3dfbabb9ba13511ec27b2',1,'cv::ximgproc::AdaptiveManifoldFilter']]], + ['settrimratio_903',['setTrimRatio',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a41f1a1566344655639a710429db8d811',1,'cv::videostab::LpMotionStabilizer::setTrimRatio()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aac98667cf80a45d764e883b5a02ae152',1,'cv::videostab::StabilizerBase::setTrimRatio()']]], + ['settruncateprunedtree_904',['setTruncatePrunedTree',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a6f2663a08abc3e872bd3f3a53a84615c',1,'cv::ml::DTrees']]], + ['settype_905',['setType',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#a8cfdfacb3adafd3a39d7b46576bcffb7',1,'cv::AgastFeatureDetector::setType()'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#ae9328e37053be0cd740d4db9cb185196',1,'cv::FastFeatureDetector::setType()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a0dd2c2aea178a3c9136eda6443d5bb7b',1,'cv::ml::SVM::setType()']]], + ['setuniquenessratio_906',['setUniquenessRatio',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a4b51d68f13f1bcd8ae3937290a1edcbd',1,'cv::stereo::StereoBinaryBM::setUniquenessRatio()'],['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#ae1611c9592222fa70425e9971023cb1e',1,'cv::stereo::StereoBinarySGBM::setUniquenessRatio()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#ab60fc9ac381c1fde378bbc205f4d5c8f',1,'cv::StereoBM::setUniquenessRatio()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ac7b3c009706c6809211b7c5e79434ebd',1,'cv::StereoSGBM::setUniquenessRatio()']]], + ['setunit_907',['setUnit',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac7cf3e0e69550d36de8778b09a645afd',1,'Eigen::MatrixBase::setUnit(Index i)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90bed3b6468a17a9054b07cde7a751a6',1,'Eigen::MatrixBase::setUnit(Index newSize, Index i)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac7cf3e0e69550d36de8778b09a645afd',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::setUnit(Index i)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90bed3b6468a17a9054b07cde7a751a6',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::setUnit(Index newSize, Index i)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac7cf3e0e69550d36de8778b09a645afd',1,'MatrixBase< Solve< Decomposition, RhsType > >::setUnit(Index i)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90bed3b6468a17a9054b07cde7a751a6',1,'MatrixBase< Solve< Decomposition, RhsType > >::setUnit(Index newSize, Index i)']]], + ['setup_908',['setUp',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#aa91feb58c31962610d94527c424bd27b',1,'cv::videostab::OnePassStabilizer::setUp()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a3106ad788ee8a1c1a8605437c26d111a',1,'cv::videostab::StabilizerBase::setUp()'],['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a3278c9bbe6b30b08a47cb841b8b8eedc',1,'cv::videostab::TwoPassStabilizer::setUp()']]], + ['setup_909',['setup',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a741fc44059111f3e2d5ba6ab1fa1d907',1,'cv::bioinspired::Retina::setup(String retinaParameterFile="", const bool applyDefaultSetupOnFailure=true)=0'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a75ee531b20e2c32892773625de5ecdb1',1,'cv::bioinspired::Retina::setup(cv::FileStorage &fs, const bool applyDefaultSetupOnFailure=true)=0'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#ac9f944965a104c355467628b07eaf887',1,'cv::bioinspired::Retina::setup(RetinaParameters newParameters)=0'],['https://docs.opencv.org/4.2.0/dd/d73/classcv_1_1bioinspired_1_1RetinaFastToneMapping.html#a378b0dccc1fe6f1ee8612d9a8d4c4c5e',1,'cv::bioinspired::RetinaFastToneMapping::setup()'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#a8fb3d6a9684a2a7a4d3f78c51e304610',1,'cv::bioinspired::TransientAreasSegmentationModule::setup(String segmentationParameterFile="", const bool applyDefaultSetupOnFailure=true)=0'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#ace738e02e33d9ced8f2f09e51142c37b',1,'cv::bioinspired::TransientAreasSegmentationModule::setup(cv::FileStorage &fs, const bool applyDefaultSetupOnFailure=true)=0'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#ae446fc8a4f317a23c191af93db7f59e8',1,'cv::bioinspired::TransientAreasSegmentationModule::setup(SegmentationParameters newParameters)=0']]], + ['setupdatebackgroundmodel_910',['setUpdateBackgroundModel',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html#a3d4f038c6c42c0760784bbf9eabc0f00',1,'cv::bgsegm::BackgroundSubtractorGMG::setUpdateBackgroundModel()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a3209883101789a84629a67e76fcc4312',1,'cv::cuda::BackgroundSubtractorGMG::setUpdateBackgroundModel()']]], + ['setupdategain_911',['setUpdateGain',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#aaf2cec1f829a8d169442ca1f01113b2e',1,'cv::detail::ExposureCompensator']]], + ['setupinitialcameraparams_912',['setUpInitialCameraParams',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a7d3b589d7502dd18a1d1dad898816b2e',1,'cv::detail::BundleAdjusterBase']]], + ['setupiplmagnochannel_913',['setupIPLMagnoChannel',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#acfec2a2bef33e6ef73a38576f645278b',1,'cv::bioinspired::Retina']]], + ['setupoplandiplparvochannel_914',['setupOPLandIPLParvoChannel',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#ac6d6767e14212b5ebd7c5bbc6477fa7a',1,'cv::bioinspired::Retina']]], + ['setupright_915',['setUpright',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#abd5499d92c0a3c89b19ad8ceeb96a1a0',1,'cv::KAZE::setUpright()'],['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html#a7314beab8610f55b472723c34e7d5d06',1,'cv::xfeatures2d::SURF::setUpright()']]], + ['setuse1serule_916',['setUse1SERule',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a08089831f9a07e0ce6a5e5faccdf31f6',1,'cv::ml::DTrees']]], + ['setuseglobalmotionprior_917',['setUseGlobalMotionPrior',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#aa919274bebb04e6e7670ae37ba2b11ec',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['setuseglobalsmootherfilter_918',['setUseGlobalSmootherFilter',['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#a3dfa809919ae3e5e025df3ee462af74e',1,'cv::ximgproc::RICInterpolator']]], + ['setusehistory_919',['setUseHistory',['https://docs.opencv.org/4.2.0/de/dca/classcv_1_1bgsegm_1_1BackgroundSubtractorCNT.html#aba1d79b65e7ee6fb9d3f40e62b248e9d',1,'cv::bgsegm::BackgroundSubtractorCNT']]], + ['setuseilluminationmodel_920',['setUseIlluminationModel',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a12cc59356f65b7320d30443f932ac38d',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['setuseinitialflow_921',['setUseInitialFlow',['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1cuda_1_1DensePyrLKOpticalFlow.html#a7973d35c2b7037820f1bb68014c248d3',1,'cv::cuda::DensePyrLKOpticalFlow::setUseInitialFlow()'],['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a114451c302634b758c2eb88cf8fca36a',1,'cv::optflow::DualTVL1OpticalFlow::setUseInitialFlow()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#acb23452acc6158e2f037f754ec5329c1',1,'cv::superres::DualTVL1OpticalFlow::setUseInitialFlow()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#a1a7c86120ebf59622b17bd5e02b358a6',1,'cv::cuda::OpticalFlowDual_TVL1::setUseInitialFlow()'],['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#ab32cb9fae52baf0fcf861b480545cb6a',1,'cv::optflow::RLOFOpticalFlowParameter::setUseInitialFlow()'],['https://docs.opencv.org/4.2.0/d7/d05/classcv_1_1cuda_1_1SparsePyrLKOpticalFlow.html#ad9ad6c08b3578ada361e7874ae7cf923',1,'cv::cuda::SparsePyrLKOpticalFlow::setUseInitialFlow()']]], + ['setuseinstrumentation_922',['setUseInstrumentation',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a09cfb71c8b9c9e222a9110b964bb2e5d',1,'cv::instr']]], + ['setuselocalinitdatacost_923',['setUseLocalInitDataCost',['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1cuda_1_1StereoConstantSpaceBP.html#ad4a691146ff2c90cb401c5d2a6667fee',1,'cv::cuda::StereoConstantSpaceBP']]], + ['setusemeannormalization_924',['setUseMeanNormalization',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a9e1ca290c78973995dcfe11da3ca0ea7',1,'cv::DISOpticalFlow']]], + ['setusenormalizedescriptor_925',['setUseNormalizeDescriptor',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html#a6713bbb15a6c7d7a09e4443a1da8c280',1,'cv::xfeatures2d::VGG']]], + ['setusenormalizeimage_926',['setUseNormalizeImage',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html#a37fe514778bc09c09494fd9c292d2155',1,'cv::xfeatures2d::VGG']]], + ['setuseopencl_927',['setUseOpenCL',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gab747fa4efd88d3188f4ebcbc8a639c1e',1,'cv::ocl::setUseOpenCL()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gab747fa4efd88d3188f4ebcbc8a639c1e',1,'setUseOpenCL()(Global Namespace)']]], + ['setuseopenvx_928',['setUseOpenVX',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a054d2cb59acdf42af649bf2ee6be1756',1,'cv']]], + ['setuseoptimized_929',['setUseOptimized',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga3c8487ea4449e550bc39575ede094c7a',1,'cv::setUseOptimized()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga3c8487ea4449e550bc39575ede094c7a',1,'setUseOptimized()(Global Namespace)']]], + ['setusepostproc_930',['setUsePostProc',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a38fe363602cd87c6bef10a80bdb92b4a',1,'cv::optflow::DenseRLOFOpticalFlow']]], + ['setusepostprocessing_931',['setUsePostProcessing',['https://docs.opencv.org/4.2.0/d4/dfa/classcv_1_1ximgproc_1_1EdgeAwareInterpolator.html#ad0df358fbf08b20453a7cbbaf33cc488',1,'cv::ximgproc::EdgeAwareInterpolator']]], + ['setuseprefilter_932',['setUsePrefilter',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#afa186227703b8206fef449ea213bb003',1,'cv::stereo::StereoBinaryBM']]], + ['setuserng_933',['setUseRNG',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a5634754563f2c06384255ad23c55bff9',1,'cv::ximgproc::AdaptiveManifoldFilter']]], + ['setusescaleorientation_934',['setUseScaleOrientation',['https://docs.opencv.org/4.2.0/d1/dfd/classcv_1_1xfeatures2d_1_1BoostDesc.html#a3589c3c2eb748b7ebb31bcbfea8129cb',1,'cv::xfeatures2d::BoostDesc::setUseScaleOrientation()'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html#af597dce79161a6dcf63151035b6de37c',1,'cv::xfeatures2d::VGG::setUseScaleOrientation()']]], + ['setusespatialpropagation_935',['setUseSpatialPropagation',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#ab34e5d41eba2c1c790eaec99c02d2ac2',1,'cv::DISOpticalFlow']]], + ['setusesurrogates_936',['setUseSurrogates',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a33d8fec217d423609a9f29a0a787111c',1,'cv::ml::DTrees']]], + ['setusesvm_937',['setUseSVM',['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a103147dc9c81aca85ffe02ee7325176a',1,'cv::ocl::Context']]], + ['setusetimstampsdim_938',['setUseTimstampsDim',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a9dc1d18c36710e96396f001503eeae18',1,'cv::dnn::LSTMLayer']]], + ['setusevariationalrefinement_939',['setUseVariationalRefinement',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#a8085dd7dfc729a43cc009215299e4c6a',1,'cv::optflow::DenseRLOFOpticalFlow::setUseVariationalRefinement()'],['https://docs.opencv.org/4.2.0/d2/da4/classcv_1_1ximgproc_1_1RICInterpolator.html#adf0843bcc6e3a9b89d806f35479e83bc',1,'cv::ximgproc::RICInterpolator::setUseVariationalRefinement()']]], + ['setvalue_940',['setValue',['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#a9df30b85b150691694ce9f0fb2ea1757',1,'cv::AsyncPromise::setValue()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a279bef7b343cbe935402be1d1ee8bdcf',1,'cv::FileNode::setValue()']]], + ['setvalues_941',['setValues',['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1EstimatedGaussDistribution.html#aa597b52d3adaece9006f88e66564aa73',1,'cv::EstimatedGaussDistribution']]], + ['setvariationalrefinementalpha_942',['setVariationalRefinementAlpha',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a565bcd4da1df9fcd0bbcb1a3459a1dd5',1,'cv::DISOpticalFlow']]], + ['setvariationalrefinementdelta_943',['setVariationalRefinementDelta',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#ae8bf8a4f43a4c353969dd736350afac4',1,'cv::DISOpticalFlow']]], + ['setvariationalrefinementgamma_944',['setVariationalRefinementGamma',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a7967d16857c013a2c27137f324eb1558',1,'cv::DISOpticalFlow']]], + ['setvariationalrefinementiterations_945',['setVariationalRefinementIterations',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#a33f28030c8c7707f9102c1bc1cc09bf3',1,'cv::DISOpticalFlow']]], + ['setvarinit_946',['setVarInit',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a55b91818465653df3672638c1e864bab',1,'cv::BackgroundSubtractorMOG2']]], + ['setvarmax_947',['setVarMax',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a2026951d9331d299f14279d53ffb202a',1,'cv::BackgroundSubtractorMOG2']]], + ['setvarmin_948',['setVarMin',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a62fd4f08f4528a1f849346139d58e863',1,'cv::BackgroundSubtractorMOG2']]], + ['setvarthreshold_949',['setVarThreshold',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#ab58c51659a49f9d8bfdf7062cf4859b5',1,'cv::BackgroundSubtractorMOG2']]], + ['setvarthresholdgen_950',['setVarThresholdGen',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a0afcbbdc16fd13918e2044c2bab10ba4',1,'cv::BackgroundSubtractorMOG2']]], + ['setvertexarray_951',['setVertexArray',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a56b47850185699e7b248ac16b25dd75a',1,'cv::ogl::Arrays']]], + ['setviewerpose_952',['setViewerPose',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#aff7e90b2280f3ffa95ec63bdce28e267',1,'cv::viz::Viz3d']]], + ['setvocabulary_953',['setVocabulary',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#a9d8425d78fc4e81991a80e471d6089e6',1,'cv::BOWImgDescriptorExtractor']]], + ['setvotesthreshold_954',['setVotesThreshold',['https://docs.opencv.org/4.2.0/dc/d46/classcv_1_1GeneralizedHoughBallard.html#ab848522772940cef12dd36e382a75a5d',1,'cv::GeneralizedHoughBallard::setVotesThreshold()'],['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#ab3290bedb053fc9d1583d9a0170d2c85',1,'cv::cuda::HoughCirclesDetector::setVotesThreshold()']]], + ['setw_955',['setW',['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#a7c000aa5edbe942c480c2cb04f25a213',1,'cv::saliency::ObjectnessBING']]], + ['setw_956',['setw',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2be7f420a95880805d0d7e2543240440',1,'std']]], + ['setwarper_957',['setWarper',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#adb1219c1caae710736a5a5e6b13ad21b',1,'cv::Stitcher']]], + ['setwarpingsnumber_958',['setWarpingsNumber',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#af4cbe53b38cdd46e0ac93400e79d09d3',1,'cv::optflow::DualTVL1OpticalFlow::setWarpingsNumber()'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html#a2ff5a6cdee569406bb0e598e7455449c',1,'cv::superres::DualTVL1OpticalFlow::setWarpingsNumber()']]], + ['setwavecorrection_959',['setWaveCorrection',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a968a2f4a1faddfdacbcfce54b44bab70',1,'cv::Stitcher']]], + ['setwavecorrectkind_960',['setWaveCorrectKind',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a17413f5c06e4e569bfd45e01d4e8ff4a',1,'cv::Stitcher']]], + ['setweakcount_961',['setWeakCount',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a53c6a2b7dbe717872b32c1659ce9b032',1,'cv::ml::Boost']]], + ['setweight_962',['setWeight',['https://docs.opencv.org/4.2.0/d1/d74/structHaarFeature64.html#ab565bd4a42ee7091c3130106000f5383',1,'HaarFeature64::setWeight()'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a644513e799afdefdb0e37a1bb4abc2d7',1,'cv::xfeatures2d::PCTSignatures::setWeight()']]], + ['setweight1_963',['setWeight1',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a8b2b01a104671f9fd6dd6518fb3ce1a8',1,'cv::videostab::LpMotionStabilizer']]], + ['setweight2_964',['setWeight2',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#af7bb33735451b27d34177bc3491a8670',1,'cv::videostab::LpMotionStabilizer']]], + ['setweight3_965',['setWeight3',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#acb11f0167a147074452b34050d8b5297',1,'cv::videostab::LpMotionStabilizer']]], + ['setweight4_966',['setWeight4',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a13f4c831757489d682476448bbe62549',1,'cv::videostab::LpMotionStabilizer']]], + ['setweighta_967',['setWeightA',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#adb1cdee9bc21e1486795970ad4f5226f',1,'cv::xfeatures2d::PCTSignatures']]], + ['setweightb_968',['setWeightB',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a076170589f3fe0c1f306e42a5a3e2962',1,'cv::xfeatures2d::PCTSignatures']]], + ['setweightcontrast_969',['setWeightContrast',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#aefbda82326aa30a385616a609e653097',1,'cv::xfeatures2d::PCTSignatures']]], + ['setweightentropy_970',['setWeightEntropy',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#ad4284dee436fef8bbc5153cf01cc69db',1,'cv::xfeatures2d::PCTSignatures']]], + ['setweightl_971',['setWeightL',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#abc703d4edfecaeae94dfdab813fff5f1',1,'cv::xfeatures2d::PCTSignatures']]], + ['setweights_972',['setWeights',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a57b036d9f54ec982203bd63ea42559a0',1,'cv::dnn::LSTMLayer::setWeights()'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a0fcdbc44a5a48b4b24e6c182ca7045f7',1,'cv::xfeatures2d::PCTSignatures::setWeights()'],['https://docs.opencv.org/4.2.0/dd/dfd/classcv_1_1dnn_1_1RNNLayer.html#a115817278a78736e2e77671eb0a04279',1,'cv::dnn::RNNLayer::setWeights()']]], + ['setweighttrimrate_973',['setWeightTrimRate',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#aa5880dc1bd70c5413bf5feb19ae03322',1,'cv::ml::Boost']]], + ['setweightx_974',['setWeightX',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#ab92c90a1047a839b7946c6711eafb678',1,'cv::xfeatures2d::PCTSignatures']]], + ['setweighty_975',['setWeightY',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#ac7a4326f24547f0e21f5b14c0e91d7f7',1,'cv::xfeatures2d::PCTSignatures']]], + ['setwhitelist_976',['setWhiteList',['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html#a8da3a4ea4f7fab0f5030a9cf3675b197',1,'cv::text::OCRTesseract']]], + ['setwhitethreshold_977',['setWhiteThreshold',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1structured__light_1_1GrayCodePattern.html#aeaf08cd487c5d2894eda4ebd1eea6322',1,'cv::structured_light::GrayCodePattern']]], + ['setwidgetpose_978',['setWidgetPose',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#ad8524056718268079708503d5f9e2a12',1,'cv::viz::Viz3d']]], + ['setwidthofband_979',['setWidthOfBand',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#afe10048428e4b8768a494c7aca5cc154',1,'cv::line_descriptor::BinaryDescriptor']]], + ['setwindowposition_980',['setWindowPosition',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a0f5c64d835a2350065a7dbbd741f26f8',1,'cv::viz::Viz3d']]], + ['setwindowproperty_981',['setWindowProperty',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga66e4a6db4d4e06148bcdfe0d70a5df27',1,'cv::setWindowProperty()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga66e4a6db4d4e06148bcdfe0d70a5df27',1,'setWindowProperty()(Global Namespace)']]], + ['setwindowradius_982',['setWindowRadius',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a424bb76f76544c6f04777d806a033541',1,'cv::xfeatures2d::PCTSignatures']]], + ['setwindowsize_983',['setWindowSize',['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#a3febec742396f7fc02bcb95d78e51f5a',1,'cv::viz::Camera::setWindowSize()'],['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#aa55d53902b5d121994d905c5d842fc3e',1,'cv::rgbd::DepthCleaner::setWindowSize()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1superres_1_1FarnebackOpticalFlow.html#a05d03196a2428dcf56e28b7c22614f62',1,'cv::superres::FarnebackOpticalFlow::setWindowSize()'],['https://docs.opencv.org/4.2.0/de/d2b/classcv_1_1superres_1_1PyrLKOpticalFlow.html#a73a65396d9d133a05a8353a51bab1109',1,'cv::superres::PyrLKOpticalFlow::setWindowSize()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#ac17b20101f2063cf0df974cc5ba39a4d',1,'cv::rgbd::RgbdNormals::setWindowSize()'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a7fb977094a1fe0494136028b35518fa0',1,'cv::viz::Viz3d::setWindowSize()']]], + ['setwindowtitle_984',['setWindowTitle',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga56f8849295fd10d0c319724ddb773d96',1,'cv::setWindowTitle()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga56f8849295fd10d0c319724ddb773d96',1,'setWindowTitle()(Global Namespace)']]], + ['setwinsigma_985',['setWinSigma',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#ab291779ff8ac649174b102f64c5f9012',1,'cv::cuda::HOG']]], + ['setwinsize_986',['setWinSize',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a6a2bf0ae58a6d3474ed9d8071777e45a',1,'cv::CvHaarEvaluator::setWinSize(Size patchSize)'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a80868059bfa4a6408eadd308c4fd5439',1,'cv::CvHaarEvaluator::setWinSize() const'],['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1cuda_1_1DensePyrLKOpticalFlow.html#a9151702e0186460e99583b236b82ad99',1,'cv::cuda::DensePyrLKOpticalFlow::setWinSize()'],['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#aac38b4be9d384303cd196562df65a42c',1,'cv::FarnebackOpticalFlow::setWinSize()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#a1318d300f9621bfa26be459750aa46eb',1,'cv::cuda::FarnebackOpticalFlow::setWinSize()'],['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html#a55c27f213c1925d78319fdfdf5c8e3db',1,'cv::videostab::PyrLkOptFlowEstimatorBase::setWinSize()'],['https://docs.opencv.org/4.2.0/d7/d05/classcv_1_1cuda_1_1SparsePyrLKOpticalFlow.html#a10252abdc48787ee10db950dbc46fa91',1,'cv::cuda::SparsePyrLKOpticalFlow::setWinSize()'],['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html#a1af197164636e701cc34224e10284d36',1,'cv::SparsePyrLKOpticalFlow::setWinSize()']]], + ['setwinstride_987',['setWinStride',['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a5e74646651209ae13f1b3dd18179773f',1,'cv::cuda::HOG']]], + ['setwobblesuppressor_988',['setWobbleSuppressor',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#ad0a574ccd17df9d2a59acee82fad97a0',1,'cv::videostab::TwoPassStabilizer']]], + ['setwta_5fk_989',['setWTA_K',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#ac499c951d4ed95733872ef7264096198',1,'cv::ORB']]], + ['setxi_990',['setXi',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#a458db3935a496e66c631745ceeb6ca8a',1,'cv::GeneralizedHoughGuil']]], + ['setzero_991',['setZero',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af230a143de50695d2d1fae93db7e4dcb',1,'Eigen::DenseBase::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af230a143de50695d2d1fae93db7e4dcb',1,'DenseBase< ArrayWrapper< ExpressionType > >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af230a143de50695d2d1fae93db7e4dcb',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af230a143de50695d2d1fae93db7e4dcb',1,'DenseBase< Solve< Decomposition, RhsType > >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#ad4d81f0bf2bdb022d1910a89a6f8c819',1,'Eigen::DiagonalMatrix::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a293457cb23a0a2c95c44a1c6101ef218',1,'Eigen::DiagonalMatrix::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a776d0ab6c980847297d25b03b5d2216a',1,'Eigen::LDLT::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'Eigen::PlainObjectBase::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'Eigen::PlainObjectBase::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'Eigen::PlainObjectBase::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'Eigen::PlainObjectBase::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#acc39eaf7ba22b725c86f1b9b8bb57c3c',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a73ab57abb640bf35e0dbf9dba225a1db',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af57b7361afefe60e2940802e7ef2ca54',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#aee6d32f2e6615645b5f1152f99bc8549',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::setZero(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3c7416090f913e8685523cb3ab7c2f7',1,'Eigen::SparseMatrix::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3c7416090f913e8685523cb3ab7c2f7',1,'SparseMatrix< Scalar >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3c7416090f913e8685523cb3ab7c2f7',1,'SparseMatrix< Scalar, ColMajor, int >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3c7416090f913e8685523cb3ab7c2f7',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ad3c7416090f913e8685523cb3ab7c2f7',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::setZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a7530e86074859407aaec5132549b40ee',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::setZero()']]], + ['sf_5fbgr_992',['SF_BGR',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cba4984532228f149a206ed70dc7be2b054',1,'cv::cudacodec::SF_BGR'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cba4984532228f149a206ed70dc7be2b054',1,'SF_BGR(Global Namespace)']]], + ['sf_5fgray_993',['SF_GRAY',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbaa380f41af7e9c6dc9fb0811bbbadc52e',1,'cv::cudacodec::SF_GRAY'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbaa380f41af7e9c6dc9fb0811bbbadc52e',1,'SF_GRAY(Global Namespace)']]], + ['sf_5fiyuv_994',['SF_IYUV',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbae762b2d49e4da60176d7fa421e2e58cb',1,'cv::cudacodec::SF_IYUV'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbae762b2d49e4da60176d7fa421e2e58cb',1,'SF_IYUV(Global Namespace)']]], + ['sf_5fnv12_995',['SF_NV12',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbae657d7c1840a839a72084d28fffe1798',1,'cv::cudacodec::SF_NV12'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbae657d7c1840a839a72084d28fffe1798',1,'SF_NV12(Global Namespace)']]], + ['sf_5fuyvy_996',['SF_UYVY',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbaa08bc5c4df5b13ef55344dbaa7d776aa',1,'cv::cudacodec::SF_UYVY'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbaa08bc5c4df5b13ef55344dbaa7d776aa',1,'SF_UYVY(Global Namespace)']]], + ['sf_5fyuy2_997',['SF_YUY2',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cba10e3c0d2167a7c73c519b7ac9f54d4b6',1,'cv::cudacodec::SF_YUY2'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cba10e3c0d2167a7c73c519b7ac9f54d4b6',1,'SF_YUY2(Global Namespace)']]], + ['sf_5fyv12_998',['SF_YV12',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbaeb34ec62ac19eab0731d4ce8040ddb30',1,'cv::cudacodec::SF_YV12'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ggaaac1ece32d7b3efa9afc9811315d35cbaeb34ec62ac19eab0731d4ce8040ddb30',1,'SF_YV12(Global Namespace)']]], + ['sfm_20module_20installation_999',['SFM module installation',['https://docs.opencv.org/4.2.0/db/db8/tutorial_sfm_installation.html',1,'']]], + ['sfm_2ehpp_1000',['sfm.hpp',['https://docs.opencv.org/4.2.0/d3/df9/sfm_8hpp.html',1,'']]], + ['sfm_5fdistortion_5fmodel_5fdivision_1001',['SFM_DISTORTION_MODEL_DIVISION',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#gga01602a9fa571c97ac52b35350e4c48fbaad60cf064485340c3f5bd866b98dea56',1,'cv::sfm::SFM_DISTORTION_MODEL_DIVISION'],['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#gga01602a9fa571c97ac52b35350e4c48fbaad60cf064485340c3f5bd866b98dea56',1,'SFM_DISTORTION_MODEL_DIVISION(Global Namespace)']]], + ['sfm_5fdistortion_5fmodel_5fpolynomial_1002',['SFM_DISTORTION_MODEL_POLYNOMIAL',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#gga01602a9fa571c97ac52b35350e4c48fbaed2c8936165cc35b920a6e45089f5d57',1,'cv::sfm::SFM_DISTORTION_MODEL_POLYNOMIAL'],['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#gga01602a9fa571c97ac52b35350e4c48fbaed2c8936165cc35b920a6e45089f5d57',1,'SFM_DISTORTION_MODEL_POLYNOMIAL(Global Namespace)']]], + ['sfm_5fimport_5freconstruction_2emarkdown_1003',['sfm_import_reconstruction.markdown',['https://docs.opencv.org/4.2.0/db/d43/sfm__import__reconstruction_8markdown.html',1,'']]], + ['sfm_5finstallation_2emarkdown_1004',['sfm_installation.markdown',['https://docs.opencv.org/4.2.0/d4/dbe/sfm__installation_8markdown.html',1,'']]], + ['sfm_5fio_5fbundler_1005',['SFM_IO_BUNDLER',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032abf49ab84b44c1c6bec4b68b268001941',1,'cv::sfm::SFM_IO_BUNDLER'],['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032abf49ab84b44c1c6bec4b68b268001941',1,'SFM_IO_BUNDLER(Global Namespace)']]], + ['sfm_5fio_5fopenmvg_1006',['SFM_IO_OPENMVG',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a1b9130c03a4bd60d285ac4d56065fa51',1,'cv::sfm::SFM_IO_OPENMVG'],['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a1b9130c03a4bd60d285ac4d56065fa51',1,'SFM_IO_OPENMVG(Global Namespace)']]], + ['sfm_5fio_5fopensfm_1007',['SFM_IO_OPENSFM',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a87f8db6b133638d9397579067dc900ca',1,'cv::sfm::SFM_IO_OPENSFM'],['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a87f8db6b133638d9397579067dc900ca',1,'SFM_IO_OPENSFM(Global Namespace)']]], + ['sfm_5fio_5ftheiasfm_1008',['SFM_IO_THEIASFM',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a3b88a1709635d73d377870d7b09f2690',1,'cv::sfm::SFM_IO_THEIASFM'],['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a3b88a1709635d73d377870d7b09f2690',1,'SFM_IO_THEIASFM(Global Namespace)']]], + ['sfm_5fio_5fvisualsfm_1009',['SFM_IO_VISUALSFM',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a777693dd917a3358b58f64061227bf42',1,'cv::sfm::SFM_IO_VISUALSFM'],['https://docs.opencv.org/4.2.0/d2/da3/group__io.html#ggaef6358a092532808255198d7e6dc5032a777693dd917a3358b58f64061227bf42',1,'SFM_IO_VISUALSFM(Global Namespace)']]], + ['sfm_5frefine_5ffocal_5flength_1010',['SFM_REFINE_FOCAL_LENGTH',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a6530505c3c95c8d634079f893f89ffb9',1,'cv::sfm::SFM_REFINE_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a6530505c3c95c8d634079f893f89ffb9',1,'SFM_REFINE_FOCAL_LENGTH(Global Namespace)']]], + ['sfm_5frefine_5fprincipal_5fpoint_1011',['SFM_REFINE_PRINCIPAL_POINT',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a09e0f30a18c69bedcda6062294393665',1,'cv::sfm::SFM_REFINE_PRINCIPAL_POINT'],['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a09e0f30a18c69bedcda6062294393665',1,'SFM_REFINE_PRINCIPAL_POINT(Global Namespace)']]], + ['sfm_5frefine_5fradial_5fdistortion_5fk1_1012',['SFM_REFINE_RADIAL_DISTORTION_K1',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a8ee40c6701881a34b95a1c39ed1ce6b8',1,'cv::sfm::SFM_REFINE_RADIAL_DISTORTION_K1'],['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a8ee40c6701881a34b95a1c39ed1ce6b8',1,'SFM_REFINE_RADIAL_DISTORTION_K1(Global Namespace)']]], + ['sfm_5frefine_5fradial_5fdistortion_5fk2_1013',['SFM_REFINE_RADIAL_DISTORTION_K2',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a59c1a1d32d8dc6f0e65c439b3687c86f',1,'cv::sfm::SFM_REFINE_RADIAL_DISTORTION_K2'],['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html#ggacca2d8c213e2e8b9f83bb36b083fbd91a59c1a1d32d8dc6f0e65c439b3687c86f',1,'SFM_REFINE_RADIAL_DISTORTION_K2(Global Namespace)']]], + ['sfm_5fscene_5freconstruction_2emarkdown_1014',['sfm_scene_reconstruction.markdown',['https://docs.opencv.org/4.2.0/dc/d39/sfm__scene__reconstruction_8markdown.html',1,'']]], + ['sfm_5ftrajectory_5festimation_2emarkdown_1015',['sfm_trajectory_estimation.markdown',['https://docs.opencv.org/4.2.0/d3/d94/sfm__trajectory__estimation_8markdown.html',1,'']]], + ['sfmlibmveuclideanreconstruction_1016',['SFMLibmvEuclideanReconstruction',['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html',1,'cv::sfm']]], + ['sgd_1017',['SGD',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#ab028695cc8ec1491888d8d03f80bc8c2ab85c6ad25c382a69f12a7b5d970cb112',1,'cv::ml::SVMSGD']]], + ['sgetc_1018',['sgetc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'__gnu_cxx::enc_filebuf::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'__gnu_cxx::stdio_filebuf::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'__gnu_cxx::stdio_sync_filebuf::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'basic_filebuf< char_type, traits_type >::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'basic_streambuf< _Elem, _Tr >::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'basic_streambuf< char, _Traits >::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'basic_streambuf< char, char_traits< char > >::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'std::basic_filebuf::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'std::basic_streambuf::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'std::basic_stringbuf::sgetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ac773fb2c87cf938fb6eb89c987f8e04e',1,'std::wbuffer_convert::sgetc()']]], + ['sgetn_1019',['sgetn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'__gnu_cxx::enc_filebuf::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'__gnu_cxx::stdio_filebuf::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'__gnu_cxx::stdio_sync_filebuf::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'basic_filebuf< char_type, traits_type >::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'basic_streambuf< _Elem, _Tr >::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'basic_streambuf< char, _Traits >::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'basic_streambuf< char, char_traits< char > >::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'std::basic_filebuf::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'std::basic_streambuf::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'std::basic_stringbuf::sgetn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a7cfb11ce1eb1a31cf82d7a876c35351b',1,'std::wbuffer_convert::sgetn()']]], + ['sgi_1020',['SGI',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html',1,'']]], + ['shading_1021',['SHADING',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca01452d0c5c4ba91f3d0cb1aa94cf9b36',1,'cv::viz::SHADING'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca01452d0c5c4ba91f3d0cb1aa94cf9b36',1,'SHADING(Global Namespace)']]], + ['shading_5fflat_1022',['SHADING_FLAT',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggaf05708ceb519dea9e16744b5fd56c5e2ac1d13fb38b0b5feb9b38385efd7ff970',1,'cv::viz::SHADING_FLAT'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggaf05708ceb519dea9e16744b5fd56c5e2ac1d13fb38b0b5feb9b38385efd7ff970',1,'SHADING_FLAT(Global Namespace)']]], + ['shading_5fgouraud_1023',['SHADING_GOURAUD',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggaf05708ceb519dea9e16744b5fd56c5e2af649f45acd495f6c82a4da9a9fc367fe',1,'cv::viz::SHADING_GOURAUD'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggaf05708ceb519dea9e16744b5fd56c5e2af649f45acd495f6c82a4da9a9fc367fe',1,'SHADING_GOURAUD(Global Namespace)']]], + ['shading_5fphong_1024',['SHADING_PHONG',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggaf05708ceb519dea9e16744b5fd56c5e2a9f5dda86ef76075b021ab066af408fbd',1,'cv::viz::SHADING_PHONG'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggaf05708ceb519dea9e16744b5fd56c5e2a9f5dda86ef76075b021ab066af408fbd',1,'SHADING_PHONG(Global Namespace)']]], + ['shadingvalues_1025',['ShadingValues',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gaf05708ceb519dea9e16744b5fd56c5e2',1,'cv::viz::ShadingValues'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gaf05708ceb519dea9e16744b5fd56c5e2',1,'ShadingValues(Global Namespace)']]], + ['shape_1026',['shape',['https://docs.opencv.org/4.2.0/da/d1b/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GArray_3_01T_01_4_01_4.html#ac3001f5e2adac265aa5c3fdddfaf0c6a',1,'cv::detail::GTypeTraits< cv::GArray< T > >::shape'],['https://docs.opencv.org/4.2.0/d0/d17/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GMat_01_4.html#af06bf4c84018ab41553899390e586e7c',1,'cv::detail::GTypeTraits< cv::GMat >::shape'],['https://docs.opencv.org/4.2.0/df/d42/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GMatP_01_4.html#a018358568e48e311f0f204d6d4b44926',1,'cv::detail::GTypeTraits< cv::GMatP >::shape'],['https://docs.opencv.org/4.2.0/dc/db5/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GScalar_01_4.html#a8fd029fb4a3aef7506964d90ce5e7d11',1,'cv::detail::GTypeTraits< cv::GScalar >::shape'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a270ae5dc357c85f7fec6d94470b52189',1,'cv::dnn::shape(const int *dims, const int n)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a4945f789f41ace4a6c6f04bcbf722eb8',1,'cv::dnn::shape(const Mat &mat)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#ae9fde5a054f96266528e875c5a67d338',1,'cv::dnn::shape(const MatSize &sz)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a0eba3cf13e42df5456b480161f62eb22',1,'cv::dnn::shape(const UMat &mat)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#aee924c1bbfcc83e730882abcdbe49d06',1,'cv::dnn::shape(int a0, int a1=-1, int a2=-1, int a3=-1)']]], + ['shape_20descriptors_1027',['Structural Analysis and Shape Descriptors',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'']]], + ['shape_20distance_20and_20matching_1028',['Shape Distance and Matching',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html',1,'']]], + ['shape_2ehpp_1029',['shape.hpp',['https://docs.opencv.org/4.2.0/db/d0f/shape_2shape_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d30/shape_8hpp.html',1,'(Global Namespace)']]], + ['shape_5faffinity_5fw_1030',['shape_affinity_w',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#aeaa30b59ae419379b13bef9afbd03476',1,'cv::tbm::TrackerParams']]], + ['shape_5fdistance_2ehpp_1031',['shape_distance.hpp',['https://docs.opencv.org/4.2.0/d4/d7c/shape__distance_8hpp.html',1,'']]], + ['shape_5foffset_1032',['shape_offset',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a77a7ae55fe679ff7e5b6556a979c2b3c',1,'cv::face::FacemarkLBF::Params']]], + ['shape_5ftransformer_2ehpp_1033',['shape_transformer.hpp',['https://docs.opencv.org/4.2.0/dc/d27/shape__transformer_8hpp.html',1,'']]], + ['shape_5futils_2ehpp_1034',['shape_utils.hpp',['https://docs.opencv.org/4.2.0/d1/ddb/shape__utils_8hpp.html',1,'']]], + ['shapecontextdistanceextractor_1035',['ShapeContextDistanceExtractor',['https://docs.opencv.org/4.2.0/d8/de3/classcv_1_1ShapeContextDistanceExtractor.html',1,'cv']]], + ['shapedistanceextractor_1036',['ShapeDistanceExtractor',['https://docs.opencv.org/4.2.0/dc/dbf/classcv_1_1ShapeDistanceExtractor.html',1,'cv']]], + ['shapematchmodes_1037',['ShapeMatchModes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf2b97a230b51856d09a2d934b78c015f',1,'cv::ShapeMatchModes'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf2b97a230b51856d09a2d934b78c015f',1,'ShapeMatchModes(Global Namespace)']]], + ['shapetransformer_1038',['ShapeTransformer',['https://docs.opencv.org/4.2.0/df/dfe/classcv_1_1ShapeTransformer.html',1,'cv']]], + ['shared_1039',['SHARED',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#aa0d69b2aa95680a6b2af6dc4dda44e16ac5eb57263e17573194ea66ab06b1bdb6',1,'cv::cuda::HostMem']]], + ['shared_5fatomics_1040',['SHARED_ATOMICS',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a63dd888f7ac8c7e6716af80bb9580ad5',1,'cv::cuda::SHARED_ATOMICS'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a63dd888f7ac8c7e6716af80bb9580ad5',1,'SHARED_ATOMICS(Global Namespace)']]], + ['shared_5ffuture_1041',['shared_future',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02243.html',1,'std::shared_future< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02243.html#a7abac9b976a7f293a80951ddc77c61a9',1,'std::shared_future::shared_future(const shared_future &__sf) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02243.html#aa1f48e4ac60e93f1eccaf5c4992e5af9',1,'std::shared_future::shared_future(future< _Res > &&__uf) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02243.html#a39eb67ba5bfeda967888f6f8fafd0de8',1,'std::shared_future::shared_future(shared_future &&__sf) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02359.html#abf5c5217a5d88d363cf2b0c09b44b4a0',1,'std::shared_future< _Res & >::shared_future(const shared_future &__sf)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02359.html#a9fa8ab7bbe6469a0d4f3f2e246db6a8d',1,'std::shared_future< _Res & >::shared_future(future< _Res & > &&__uf) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02359.html#ae6d05bb66171df7a69ccbcf3d0a14059',1,'std::shared_future< _Res & >::shared_future(shared_future &&__sf) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02363.html#ad638460091d07d1688a8fdb974acacc5',1,'std::shared_future< void >::shared_future(const shared_future &__sf)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02363.html#a98919d50a2faca6306005a458236176f',1,'std::shared_future< void >::shared_future(future< void > &&__uf) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02363.html#ad2689035011932d007e07c10e1e48d47',1,'std::shared_future< void >::shared_future(shared_future &&__sf) noexcept']]], + ['shared_5ffuture_3c_20_5fres_20_26_20_3e_1042',['shared_future< _Res & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02359.html',1,'std']]], + ['shared_5ffuture_3c_20void_20_3e_1043',['shared_future< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02363.html',1,'std']]], + ['shared_5flock_1044',['shared_lock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02783.html',1,'std']]], + ['shared_5flock_5fguard_1045',['shared_lock_guard',['https://docs.opencv.org/4.2.0/d9/d7f/classcv_1_1utils_1_1shared__lock__guard.html',1,'cv::utils::shared_lock_guard< class >'],['https://docs.opencv.org/4.2.0/d9/d7f/classcv_1_1utils_1_1shared__lock__guard.html#aa7dda3bed283ad9fc84e0449fc0546c0',1,'cv::utils::shared_lock_guard::shared_lock_guard()']]], + ['shared_5fmutex_1046',['shared_mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00137.html',1,'']]], + ['shared_5fptr_1047',['shared_ptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std::shared_ptr< _Tp >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< _Dir >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< _Dir >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< _Dir >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< _Dir >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< _Dir >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< _Dir >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< _Dir >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< _Dir >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< _Dir >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< _Dir >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< _Dir >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< _Dir >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< _Dir_stack >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< _Dir_stack >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< _Dir_stack >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< _Dir_stack >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< _Dir_stack >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< _Dir_stack >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< _Dir_stack >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< _Dir_stack >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< _Dir_stack >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< _Dir_stack >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< _Dir_stack >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< _Dir_stack >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< _RegexT >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< _RegexT >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< _RegexT >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< _RegexT >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< _RegexT >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< _RegexT >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< _RegexT >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< _RegexT >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< _RegexT >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< _RegexT >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< _RegexT >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< _RegexT >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< _State >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< _State >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< _State >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< _State >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< _State >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< _State >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< _State >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< _State >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< _State >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< _State >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< _State >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< _State >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< _State_base >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< _State_base >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< _State_base >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< _State_base >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< _State_base >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< _State_base >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< _State_base >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< _State_base >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< _State_base >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< _State_base >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< _State_base >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< _State_base >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< _State_type >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< _State_type >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< _State_type >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< _State_type >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< _State_type >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< _State_type >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< _State_type >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< _State_type >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< _State_type >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< _State_type >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< _State_type >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< _State_type >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'shared_ptr< std::mutex >::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'shared_ptr< std::mutex >::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'shared_ptr< std::mutex >::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'shared_ptr< std::mutex >::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'shared_ptr< std::mutex >::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'shared_ptr< std::mutex >::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'shared_ptr< std::mutex >::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'shared_ptr< std::mutex >::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'shared_ptr< std::mutex >::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'shared_ptr< std::mutex >::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'shared_ptr< std::mutex >::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'shared_ptr< std::mutex >::shared_ptr(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a4497f1d5421073bd8c1ee305414c4e80',1,'std::shared_ptr::shared_ptr() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a7752bdf2d4dc3f4f5719fd05f2d92089',1,'std::shared_ptr::shared_ptr(_Yp *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a8b115d3d42304820c9942ddeb58644ee',1,'std::shared_ptr::shared_ptr(_Yp *__p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a893642e27fcab50317ba7d91392c0871',1,'std::shared_ptr::shared_ptr(nullptr_t __p, _Deleter __d)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a2b1f604b01d6faf7ed627624968e76b8',1,'std::shared_ptr::shared_ptr(_Yp *__p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a124c2b4fe2cd0d7651eefd22ead8f2ec',1,'std::shared_ptr::shared_ptr(nullptr_t __p, _Deleter __d, _Alloc __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a9c6e4362646c04f78bbaf043f90eb835',1,'std::shared_ptr::shared_ptr(const shared_ptr< _Yp > &__r, element_type *__p) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a1dad8483fa6f0d7507549bb8200c4de9',1,'std::shared_ptr::shared_ptr(const shared_ptr< _Yp > &__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a5bd9976c3d66cf2a62904ebaeeab76e6',1,'std::shared_ptr::shared_ptr(shared_ptr &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#a21c103ae1494cc05477bd22ec5c284fc',1,'std::shared_ptr::shared_ptr(shared_ptr< _Yp > &&__r) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aaab9ea5e4dc2ab2b17b5a25cd1b58cf3',1,'std::shared_ptr::shared_ptr(const weak_ptr< _Yp > &__r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#ac924c816f979c01f5adc42407b2fac83',1,'std::shared_ptr::shared_ptr(nullptr_t) noexcept']]], + ['shared_5fptr_3c_20_5fdir_20_3e_1048',['shared_ptr< _Dir >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], + ['shared_5fptr_3c_20_5fdir_5fstack_20_3e_1049',['shared_ptr< _Dir_stack >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], + ['shared_5fptr_3c_20_5fregext_20_3e_1050',['shared_ptr< _RegexT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], + ['shared_5fptr_3c_20_5fstate_20_3e_1051',['shared_ptr< _State >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], + ['shared_5fptr_3c_20_5fstate_5fbase_20_3e_1052',['shared_ptr< _State_base >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], + ['shared_5fptr_3c_20_5fstate_5ftype_20_3e_1053',['shared_ptr< _State_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], + ['shared_5fptr_3c_20ar_3a_3amarkerset_20_3e_1054',['shared_ptr< AR::MarkerSet >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20bool_20_3e_1055',['shared_ptr< bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20const_20_5f_5fdetail_3a_3a_5fnfa_3c_20_5frx_5ftraits_20_3e_20_3e_1056',['shared_ptr< const __detail::_NFA< _Rx_traits > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], + ['shared_5fptr_3c_20const_20cv_3a_3aoptflow_3a_3apcaprior_20_3e_1057',['shared_ptr< const cv::optflow::PCAPrior >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20const_20kinematics_3a_3aforwardarmkinematics_3c_20d_2c_20n_20_3e_20_3e_1058',['shared_ptr< const kinematics::ForwardArmKinematics< D, N > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20const_20kinematics_3a_3ainversearmkinematics_3c_20d_2c_20n_20_3e_20_3e_1059',['shared_ptr< const kinematics::InverseArmKinematics< D, N > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3aaruco_3a_3adetectorparameters_20_3e_1060',['shared_ptr< cv::aruco::DetectorParameters >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3aaruco_3a_3adictionary_20_3e_1061',['shared_ptr< cv::aruco::Dictionary >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3abasecascadeclassifier_20_3e_1062',['shared_ptr< cv::BaseCascadeClassifier >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3adescriptormatcher_20_3e_1063',['shared_ptr< cv::DescriptorMatcher >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3adetail_3a_3afeaturesmatcher_20_3e_1064',['shared_ptr< cv::detail::FeaturesMatcher >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3adetail_3a_3atypehintbase_20_3e_1065',['shared_ptr< cv::detail::TypeHintBase >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3adetectionbasedtracker_3a_3aidetector_20_3e_1066',['shared_ptr< cv::DetectionBasedTracker::IDetector >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3afeature2d_20_3e_1067',['shared_ptr< cv::Feature2D >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3amat_20_3e_1068',['shared_ptr< cv::Mat >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3aml_3a_3asvm_20_3e_1069',['shared_ptr< cv::ml::SVM >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3aquality_3a_3aqualitymse_20_3e_1070',['shared_ptr< cv::quality::QualityMSE >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3argbd_3a_3argbdnormals_20_3e_1071',['shared_ptr< cv::rgbd::RgbdNormals >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3astrongclassifierdirectselection_20_3e_1072',['shared_ptr< cv::StrongClassifierDirectSelection >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3atext_3a_3aocrbeamsearchdecoder_3a_3aclassifiercallback_20_3e_1073',['shared_ptr< cv::text::OCRBeamSearchDecoder::ClassifierCallback >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3atext_3a_3aocrhmmdecoder_3a_3aclassifiercallback_20_3e_1074',['shared_ptr< cv::text::OCRHMMDecoder::ClassifierCallback >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3atrackerfeatureset_20_3e_1075',['shared_ptr< cv::TrackerFeatureSet >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3atrackermodel_20_3e_1076',['shared_ptr< cv::TrackerModel >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3atrackersampler_20_3e_1077',['shared_ptr< cv::TrackerSampler >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3atrackerstateestimator_20_3e_1078',['shared_ptr< cv::TrackerStateEstimator >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3atracking_3a_3aukfsystemmodel_20_3e_1079',['shared_ptr< cv::tracking::UkfSystemModel >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3avideocapture_20_3e_1080',['shared_ptr< cv::VideoCapture >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3adeblurerbase_20_3e_1081',['shared_ptr< cv::videostab::DeblurerBase >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3aiframesource_20_3e_1082',['shared_ptr< cv::videostab::IFrameSource >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3ailog_20_3e_1083',['shared_ptr< cv::videostab::ILog >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3aimagemotionestimatorbase_20_3e_1084',['shared_ptr< cv::videostab::ImageMotionEstimatorBase >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3aimotionstabilizer_20_3e_1085',['shared_ptr< cv::videostab::IMotionStabilizer >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3ainpainterbase_20_3e_1086',['shared_ptr< cv::videostab::InpainterBase >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3amotionfilterbase_20_3e_1087',['shared_ptr< cv::videostab::MotionFilterBase >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cv_3a_3avideostab_3a_3awobblesuppressorbase_20_3e_1088',['shared_ptr< cv::videostab::WobbleSuppressorBase >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cvcapture_20_3e_1089',['shared_ptr< CvCapture >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20cvvideowriter_20_3e_1090',['shared_ptr< CvVideoWriter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20flann_3a_3aindex_20_3e_1091',['shared_ptr< flann::Index >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20flann_3a_3aindexparams_20_3e_1092',['shared_ptr< flann::IndexParams >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20flann_3a_3asearchparams_20_3e_1093',['shared_ptr< flann::SearchParams >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20gorigin_20_3e_1094',['shared_ptr< GOrigin >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20h264encoder_3a_3aencoderimpl_20_3e_1095',['shared_ptr< h264encoder::EncoderImpl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20imghashimpl_20_3e_1096',['shared_ptr< ImgHashImpl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20impl_20_3e_1097',['shared_ptr< Impl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20ivideocapture_20_3e_1098',['shared_ptr< IVideoCapture >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20ivideowriter_20_3e_1099',['shared_ptr< IVideoWriter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20priv_20_3e_1100',['shared_ptr< Priv >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20separatedetectionwork_20_3e_1101',['shared_ptr< SeparateDetectionWork >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20std_3a_3achrono_3a_3atime_5fpoint_3c_20dataclock_20_3e_20_3e_1102',['shared_ptr< std::chrono::time_point< dataclock > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], ['shared_5fptr_3c_20std_3a_3adeque_3c_20int_20_3e_20_3e_1103',['shared_ptr< std::deque< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20std_3a_3amutex_20_3e_1104',['shared_ptr< std::mutex >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], + ['shared_5fptr_3c_20std_3a_3amutex_20_3e_1104',['shared_ptr< std::mutex >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'shared_ptr< std::mutex >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std::shared_ptr< std::mutex >']]], ['shared_5fptr_3c_20std_3a_3athread_20_3e_1105',['shared_ptr< std::thread >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20time_5fpoint_3c_20dataclock_20_3e_20_3e_1106',['shared_ptr< time_point< dataclock > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20uint32_5ft_20_3e_1107',['shared_ptr< uint32_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20videoinputstream_20_3e_1108',['shared_ptr< VideoInputStream >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_5fatomic_2eh_1109',['shared_ptr_atomic.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00506.html',1,'']]], - ['shared_5fptr_5fbase_2eh_1110',['shared_ptr_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00509.html',1,'']]], - ['shared_5ftimed_5fmutex_1111',['shared_timed_mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02779.html',1,'std']]], - ['sharedmemperblock_1112',['sharedMemPerBlock',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a7b4b9d16c69096eed5c08d2241f23a2f',1,'cv::cuda::DeviceInfo']]], - ['sharpness_1113',['sharpness',['https://docs.opencv.org/4.2.0/d4/d69/classcv_1_1detail_1_1FeatherBlender.html#a52175c9bf5fb8ccbe692dcec2f575320',1,'cv::detail::FeatherBlender']]], - ['shear_1114',['shear',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a00c72ce1fb692fcb8b9903f4ffec4f6c',1,'cv::QtFont::shear'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ae93a25d5e15af9446d7e5bc0e7a959d0',1,'Eigen::Transform::shear()']]], - ['shi_20tomasi_20corner_20detector_1115',['Shi-Tomasi corner detector',['https://docs.opencv.org/4.2.0/d8/dd8/tutorial_good_features_to_track.html',1,'']]], - ['shi_20tomasi_20corner_20detector_20good_20features_20to_20track_1116',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], - ['shift_1117',['SHIFT',['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#aaee8f2a3f0f04415acca5f1ada1ce8edaaabb16b9959c94ef32fe148b8db588ee',1,'cv::viz::KeyboardEvent']]], - ['shift_1118',['shift',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#aa571029c188c8767217f30b1513b2c98',1,'cv::gapi::wip::draw::Circle::shift'],['https://docs.opencv.org/4.2.0/db/db3/structcv_1_1cudev_1_1DefaultTransformPolicy.html#a8c19f9716033eac39284b9f6a525ac16a12c995c60f73304ca07f58848b12f8e6',1,'cv::cudev::DefaultTransformPolicy::shift'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#acc52fba3d21e3f2460d93d6619f74e51',1,'cv::gapi::wip::draw::Line::shift'],['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#a0ebea19a04470282d18b27f228cd47b4',1,'cv::gapi::wip::draw::Poly::shift'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1dnn_1_1PowerLayer.html#a96951cd8316a3dba004888c6a0f949f6',1,'cv::dnn::PowerLayer::shift'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html#af97b87851eadb7784c3723f007b92b0a',1,'cv::gapi::wip::draw::Rect::shift'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaebe5d7bc4dea9740cdbb03d36a3e4521',1,'std::valarray::shift()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaebe5d7bc4dea9740cdbb03d36a3e4521',1,'valarray< size_t >::shift()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaebe5d7bc4dea9740cdbb03d36a3e4521',1,'shift()(Global Namespace)']]], - ['shiftlayer_1119',['ShiftLayer',['https://docs.opencv.org/4.2.0/d3/dd8/classcv_1_1dnn_1_1ShiftLayer.html',1,'cv::dnn']]], - ['shiftmat_1120',['shiftMat',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a9718fe1a611b341eb1063245c9d327e3',1,'cv::AlignMTB']]], - ['shiftvalue_1121',['shiftValue',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#a59e0895b9e37f8af2f9ff659697ae5d0',1,'cv::structured_light::SinusoidalPattern::Params']]], - ['shortdim_1122',['shortdim',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'cv::Matx::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< _Tp, cn, 1 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, 1, 3 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, 2, 2 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, 2, 3 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, 3, 3 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, 3, 4 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, 4, 4 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, cn, 1 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< float, 2, 3 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< float, 3, 3 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< float, cn, 1 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< float_type, 4, 4 >::shortdim']]], - ['show_5fimage_2ehpp_1123',['show_image.hpp',['https://docs.opencv.org/4.2.0/df/d91/show__image_8hpp.html',1,'']]], - ['show_5ftrackbar_1124',['SHOW_TRACKBAR',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html#gga5291115322efc2f86c7551ab37ab6554ac59c8b93c4987d5342beea897023e8e8',1,'cv::SHOW_TRACKBAR'],['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html#gga5291115322efc2f86c7551ab37ab6554ac59c8b93c4987d5342beea897023e8e8',1,'SHOW_TRACKBAR(Global Namespace)']]], - ['showbase_1125',['showbase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'basic_ios< char, _Traits >::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'basic_iostream< char >::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'basic_istream< char >::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'basic_istream< char, _Traits >::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'basic_ostream< char >::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'basic_ostream< char, _Traits >::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_fstream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_ifstream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_ios::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_iostream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_istream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_istringstream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_ofstream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_ostream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_ostringstream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_stringstream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::ios_base::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5a3653d71579c614748abf4a73bbed92',1,'std::showbase()']]], - ['showimage_1126',['showImage',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a9d5e364f5afd0c80d2c0c71bd24095ec',1,'cv::viz::Viz3d::showImage()'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga776e85265cd41bf22cfd8c5bfff1b045',1,'cvv::showImage(cv::InputArray img, impl::CallMetaData metaData=impl::CallMetaData(), const char *description=nullptr, const char *view=nullptr)'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#gacd3ae9dce4c81f1d7d9bf8fd04d01c60',1,'cvv::showImage(cv::InputArray img, impl::CallMetaData metaData, const ::std::string &description, const ::std::string &view="")'],['https://docs.opencv.org/4.2.0/d7/d84/namespacecvv_1_1impl.html#a5e7f1938e252a7c78ab0fa6751f06808',1,'cvv::impl::showImage()']]], - ['showmanyc_1127',['showmanyc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0e8e4218ba9766e34b74e69b17fb28b3',1,'__gnu_cxx::enc_filebuf::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0e8e4218ba9766e34b74e69b17fb28b3',1,'__gnu_cxx::stdio_filebuf::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a85e9299b4d91188c1c0070111604ece8',1,'__gnu_cxx::stdio_sync_filebuf::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0e8e4218ba9766e34b74e69b17fb28b3',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0e8e4218ba9766e34b74e69b17fb28b3',1,'basic_filebuf< char_type, traits_type >::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a85e9299b4d91188c1c0070111604ece8',1,'basic_streambuf< _Elem, _Tr >::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a85e9299b4d91188c1c0070111604ece8',1,'basic_streambuf< char, _Traits >::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a85e9299b4d91188c1c0070111604ece8',1,'basic_streambuf< char, char_traits< char > >::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0e8e4218ba9766e34b74e69b17fb28b3',1,'std::basic_filebuf::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a85e9299b4d91188c1c0070111604ece8',1,'std::basic_streambuf::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a24490a3224662a3c57cbb8f591b2acbc',1,'std::basic_stringbuf::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a85e9299b4d91188c1c0070111604ece8',1,'std::wbuffer_convert::showmanyc()']]], - ['showpoint_1128',['showpoint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'basic_ios< char, _Traits >::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'basic_iostream< char >::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'basic_istream< char >::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'basic_istream< char, _Traits >::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'basic_ostream< char >::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'basic_ostream< char, _Traits >::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_fstream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_ifstream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_ios::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_iostream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_istream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_istringstream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_ofstream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_ostream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_ostringstream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_stringstream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::ios_base::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0cd05ebd891c06400f5e04a84eb6d539',1,'std::showpoint()']]], - ['showpos_1129',['showpos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'basic_ios< char, _Traits >::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'basic_iostream< char >::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'basic_istream< char >::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'basic_istream< char, _Traits >::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'basic_ostream< char >::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'basic_ostream< char, _Traits >::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_fstream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_ifstream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_ios::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_iostream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_istream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_istringstream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_ofstream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_ostream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_ostringstream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_stringstream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::ios_base::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8eff68e8b5f8d409761a2a6db01924d3',1,'std::showpos()']]], - ['showwidget_1130',['showWidget',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a3fcc945304c6475313fd3b18f1b053fd',1,'cv::viz::Viz3d']]], - ['shrink_5fto_5ffit_1131',['shrink_to_fit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a979da4f0d7e764ee55fbafbce4ea9a3e',1,'__gnu_cxx::__versa_string::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< _CharT >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< _CharT, _Traits, _Allocator >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< char >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< char, char_traits< char >, _Byte_alloc >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< char_type, _Traits, _Alloc >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< value_type >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#abe9c2e87fe6d96dbbbf7f50f750d3cf2',1,'deque< _StateSeqT >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'match_results< _Bi_iter >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'std::basic_string::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#abe9c2e87fe6d96dbbbf7f50f750d3cf2',1,'std::deque::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'std::match_results::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'std::vector::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< __diff_type >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _CharClassT >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _CharT >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _Cmpt >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _Node *, _Nodeptr_Alloc >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _RealType >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _State< _TraitsT::char_type > >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _StringT >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< block_type, allocator_type >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< Catalog_info * >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< double >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< int >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< result_type >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< size_t >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< std::pair< _BiIter, int > >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< std::pair< _StateIdT, std::vector > >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< std::pair< _StrTransT, _StrTransT > >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< sub_match< _Bi_iter >, _Alloc >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< sub_match< _BiIter >, _Alloc >::shrink_to_fit()']]], - ['shrinkcaffemodel_1132',['shrinkCaffeModel',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga5de8769f48b44f631c1767b1700069fa',1,'cv::dnn::shrinkCaffeModel()'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga5de8769f48b44f631c1767b1700069fa',1,'shrinkCaffeModel()(Global Namespace)']]], - ['shrinkptr_1133',['shrinkPtr',['https://docs.opencv.org/4.2.0/df/db4/structcv_1_1cudev_1_1PtrTraits_3_01Expr_3_01Body_01_4_01_4.html#af182552fce54ea04e9f84e1192cfb24f',1,'cv::cudev::PtrTraits< Expr< Body > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'cv::cudev::PtrTraitsBase::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< AffineMapPtrSz, AffineMapPtr >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op >, BinaryTransformPtr< Src1Ptr, Src2Ptr, Op > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< CommonAreaInterPtrSz< SrcPtr >, CommonAreaInterPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< ConstantPtrSz< T >, ConstantPtr< T > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< CubicInterPtrSz< SrcPtr >, CubicInterPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< DerivXPtrSz< SrcPtr >, DerivXPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< DerivYPtrSz< SrcPtr >, DerivYPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< GlobPtrSz< T >, GlobPtr< T > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< GpuMat_< T >, GlobPtr< T > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< IntegerAreaInterPtrSz< SrcPtr >, IntegerAreaInterPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< LaplacianPtrSz< ksize, SrcPtr >, LaplacianPtr< ksize, SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< LinearInterPtrSz< SrcPtr >, LinearInterPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< LutPtrSz< SrcPtr, TablePtr >, LutPtr< SrcPtr, TablePtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< NearestInterPtrSz< SrcPtr >, NearestInterPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< PerspectiveMapPtrSz, PerspectiveMapPtr >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< Ptr2DSz, Ptr2DSz >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< RemapPtr1Sz< SrcPtr, MapPtr >, RemapPtr1< SrcPtr, MapPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr >, RemapPtr2< SrcPtr, MapXPtr, MapYPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< ResizePtrSz< SrcPtr >, ResizePtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< ScharrXPtrSz< SrcPtr >, ScharrXPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< ScharrYPtrSz< SrcPtr >, ScharrYPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< SingleMaskChannelsSz< MaskPtr >, SingleMaskChannels< MaskPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< SobelXPtrSz< SrcPtr >, SobelXPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< SobelYPtrSz< SrcPtr >, SobelYPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< SrcPtr, SrcPtr >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< Texture< T >, TexturePtr< T > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< UnaryTransformPtrSz< SrcPtr, Op >, UnaryTransformPtr< SrcPtr, Op > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< ZipPtrSz< PtrTuple >, ZipPtr< PtrTuple > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc7cb8a993a39e0d2ed85dc0b3599e79',1,'cv::cudev::shrinkPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc7cb8a993a39e0d2ed85dc0b3599e79',1,'shrinkPtr()(Global Namespace)']]], - ['shuffle_1134',['shuffle',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga9c197f83f8612241f91e0a44703fdeaf',1,'std::shuffle()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga9c197f83f8612241f91e0a44703fdeaf',1,'shuffle(_RandomAccessIterator __first, _RandomAccessIterator __last, _UniformRandomNumberGenerator &&__g)(Global Namespace)']]], - ['shuffle_2ehpp_1135',['shuffle.hpp',['https://docs.opencv.org/4.2.0/d1/d77/shuffle_8hpp.html',1,'']]], - ['shuffle_5forder_5fengine_1136',['shuffle_order_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html',1,'std::shuffle_order_engine< _RandomNumberEngine, __k >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a1c37fc430a7cf2349c132c90f0801923',1,'std::shuffle_order_engine::shuffle_order_engine()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a228bba34a29fdf432372dc6f605d0330',1,'std::shuffle_order_engine::shuffle_order_engine(const _RandomNumberEngine &__rng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a4b9cec5ade2194c8ceeffb2681b18699',1,'std::shuffle_order_engine::shuffle_order_engine(_RandomNumberEngine &&__rng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a70fed621d89883c406dc36076bd9729f',1,'std::shuffle_order_engine::shuffle_order_engine(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a281bbe063224c9ba2010c1ecf6e22f6c',1,'std::shuffle_order_engine::shuffle_order_engine(_Sseq &__q)']]], - ['shufflechannellayer_1137',['ShuffleChannelLayer',['https://docs.opencv.org/4.2.0/de/d24/classcv_1_1dnn_1_1ShuffleChannelLayer.html',1,'cv::dnn']]], - ['shuffletraintest_1138',['shuffleTrainTest',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#a0515ddd44168aa5c42478536375c760b',1,'cv::ml::TrainData']]], - ['si_1139',['si',['https://docs.opencv.org/4.2.0/d2/d71/classcv_1_1xfeatures2d_1_1Elliptic__KeyPoint.html#a5d626241e7fed0fc2e7adaeaa252dbda',1,'cv::xfeatures2d::Elliptic_KeyPoint']]], - ['sidetype_1140',['SideType',['https://eigen.tuxfamily.org/dox/group__enums.html#gac22de43beeac7a78b384f99bed5cee0b',1,'Eigen::SideType'],['https://eigen.tuxfamily.org/dox/group__enums.html#gac22de43beeac7a78b384f99bed5cee0b',1,'SideType(Global Namespace)']]], - ['sift_1141',['SIFT',['https://docs.opencv.org/4.2.0/d5/d3c/classcv_1_1xfeatures2d_1_1SIFT.html',1,'cv::xfeatures2d']]], - ['sift_20scale_20invariant_20feature_20transform_1142',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], - ['siftdescriptorextractor_1143',['SiftDescriptorExtractor',['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#ga2d9f078de10b03cf1ebe8102d1826901',1,'cv::xfeatures2d::SiftDescriptorExtractor'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#ga2d9f078de10b03cf1ebe8102d1826901',1,'SiftDescriptorExtractor(Global Namespace)']]], - ['siftfeaturedetector_1144',['SiftFeatureDetector',['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#gace6ee881f1443844fee1091169976208',1,'cv::xfeatures2d::SiftFeatureDetector'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#gace6ee881f1443844fee1091169976208',1,'SiftFeatureDetector(Global Namespace)']]], - ['sigma_1145',['sigma',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a978654926d6b272fa64414912e18f63a',1,'cv::TrackerKCF::Params']]], - ['sigma_5f2_1146',['sigma_2',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a7e5408f273ea4d96d6c3f0d970412d91',1,'cv::quality::QualitySSIM::_mat_data']]], - ['sigma_5fscale_1147',['sigma_scale',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#aaea0230da037d0d3506e08b86dee125f',1,'cv::line_descriptor::LSDParam']]], - ['sigmadepth_1148',['sigmaDepth',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a0f35e7ef9553b5131ab73d1f7a8bc70b',1,'cv::rgbd::FastICPOdometry']]], - ['sigmaspatial_1149',['sigmaSpatial',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a9608ce96dd2e95c19844fc5fd07bca71',1,'cv::rgbd::FastICPOdometry']]], - ['sigmoid_1150',['SIGMOID',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56ac40981025a9b8f3c1cd35cb015aac5cc',1,'cv::ml::SVM']]], - ['sigmoid_1151',['sigmoid',['https://docs.opencv.org/4.2.0/dc/d72/classcv_1_1ClfMilBoost.html#afe98709127d61a7318309087647fdb53',1,'cv::ClfMilBoost']]], - ['sigmoid_5fsym_1152',['SIGMOID_SYM',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ade71470ec8814021728f8b31b09773b0a90410002f1e243d35dca234f859f270e',1,'cv::ml::ANN_MLP']]], - ['sigmoidlayer_1153',['SigmoidLayer',['https://docs.opencv.org/4.2.0/dc/d09/classcv_1_1dnn_1_1SigmoidLayer.html',1,'cv::dnn']]], - ['sign_1154',['sign',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a831e88e0403a42d0dfb328d8acd3e56f',1,'Eigen']]], - ['signal_20processing_1155',['NPPST Signal Processing',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html',1,'']]], - ['signaling_5fnan_1156',['signaling_NaN',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#aeaa1c3844ce0a450c06cc2f81e1cf4eb',1,'std::numeric_limits']]], - ['signdeterminant_1157',['signDeterminant',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a6a8117bd54d5bb0d0d8358c2a00e095e',1,'Eigen::SparseLU']]], - ['signeddistance_1158',['signedDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#abe362349d10c5852b007958c5e1152eb',1,'Eigen::Hyperplane']]], - ['signedgradient_1159',['signedGradient',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a0c2f2db8693dbec32092bc659d25c9b9',1,'cv::HOGDescriptor']]], - ['silver_1160',['silver',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a9c9cd4141fa9474c1fb3e0618dbb9c00',1,'cv::viz::Color']]], - ['sim_5fmotor_1161',['sim_motor',['../classrobot_1_1sim__motor.html',1,'robot::sim_motor'],['../classrobot_1_1sim__motor.html#a7c49622d018ef6e87765232fd7496140',1,'robot::sim_motor::sim_motor()']]], - ['simd_5ffunctions_2ehpp_1162',['simd_functions.hpp',['https://docs.opencv.org/4.2.0/dc/db9/modules_2core_2include_2opencv2_2core_2cuda_2simd__functions_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/db5/contrib_2modules_2cudev_2include_2opencv2_2cudev_2util_2simd__functions_8hpp.html',1,'(Global Namespace)']]], - ['simd_5fintrinsics_2ehpp_1163',['simd_intrinsics.hpp',['https://docs.opencv.org/4.2.0/da/d5b/simd__intrinsics_8hpp.html',1,'']]], - ['similarity_1164',['similarity',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a4da5f6ba2c636df795c478edd4d3bc5a',1,'cv::linemod::Match']]], - ['similarity_20check_20pnsr_20and_20ssim_20on_20the_20gpu_1165',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], - ['similarity_20measurement_1166',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], - ['similarityfunction_1167',['SimilarityFunction',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#ac72268153bf12925f601c4defe7d5e50',1,'cv::xfeatures2d::PCTSignatures']]], - ['similarrects_1168',['SimilarRects',['https://docs.opencv.org/4.2.0/d1/d65/classcv_1_1SimilarRects.html',1,'cv::SimilarRects'],['https://docs.opencv.org/4.2.0/d1/d65/classcv_1_1SimilarRects.html#a547aec6ba82d071bd660637060c8a777',1,'cv::SimilarRects::SimilarRects()']]], - ['simple_20example_1169',['What happens inside Eigen, on a simple example',['https://eigen.tuxfamily.org/dox/TopicInsideEigenExample.html',1,'']]], - ['simple_20pipeline_1170',['Simple Pipeline',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html',1,'']]], - ['simple_5fpipeline_2ehpp_1171',['simple_pipeline.hpp',['https://docs.opencv.org/4.2.0/de/d65/simple__pipeline_8hpp.html',1,'']]], - ['simpleblobdetector_1172',['SimpleBlobDetector',['https://docs.opencv.org/4.2.0/d0/d7a/classcv_1_1SimpleBlobDetector.html',1,'cv']]], - ['simplewb_1173',['SimpleWB',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html',1,'cv::xphoto']]], - ['simplex_5fdownhill_2eh_1174',['simplex_downhill.h',['https://docs.opencv.org/4.2.0/dd/df3/simplex__downhill_8h.html',1,'']]], - ['simplicialcholesky_1175',['SimplicialCholesky',['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholesky.html',1,'Eigen']]], - ['simplicialcholeskybase_1176',['SimplicialCholeskyBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html',1,'Eigen::SimplicialCholeskyBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html#a098baba1dbe07ca3a775c8df1f8a0e71',1,'Eigen::SimplicialCholeskyBase::SimplicialCholeskyBase()']]], - ['simplicialldlt_1177',['SimplicialLDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html',1,'Eigen::SimplicialLDLT'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a16eb3402b26cc70f9f24da75f0c74426',1,'Eigen::SimplicialLDLT::SimplicialLDLT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a819d581e3768db316bc51f0f50fd0976',1,'Eigen::SimplicialLDLT::SimplicialLDLT(const MatrixType &matrix)']]], - ['simplicialllt_1178',['SimplicialLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html',1,'Eigen::SimplicialLLT'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#abd9294399538d5a62418cb0b62dc0cec',1,'Eigen::SimplicialLLT::SimplicialLLT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a6df9cc66170620b7f53a4d39e2c8b4f1',1,'Eigen::SimplicialLLT::SimplicialLLT(const MatrixType &matrix)']]], - ['simulatedannealingsolver_1179',['simulatedAnnealingSolver',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ga2b136c7508a37057e01ef2473694714f',1,'cv::ml::simulatedAnnealingSolver()'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ga2b136c7508a37057e01ef2473694714f',1,'simulatedAnnealingSolver()(Global Namespace)']]], - ['simulatedannealingsolversystem_1180',['SimulatedAnnealingSolverSystem',['https://docs.opencv.org/4.2.0/dc/db4/structcv_1_1ml_1_1SimulatedAnnealingSolverSystem.html',1,'cv::ml']]], - ['sin_1181',['sin',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a02f4ff0fcbbae2f3ccaa5981e8ad5e34',1,'Eigen::MatrixBase::sin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a02f4ff0fcbbae2f3ccaa5981e8ad5e34',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a02f4ff0fcbbae2f3ccaa5981e8ad5e34',1,'MatrixBase< Solve< Decomposition, RhsType > >::sin()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad7c879b58f79ccd980f4ce13fe3db49a',1,'cv::sin()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09521d0ba1e338a8709ba2b34191ece0',1,'cv::cudev::sin(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2671b223cd6902850864586638c5ac23',1,'cv::cudev::sin(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f147de79af702d8d4398a75a1521c41',1,'cv::cudev::sin(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa65ebb1958aa6daaacb7e0b94810ff87',1,'cv::cudev::sin(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ca6d7da7566d4fed9d0472b070bda3c',1,'cv::cudev::sin(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40f69179231e1d9aec1e60bf3fd67744',1,'cv::cudev::sin(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb37f9efcdb08d87d26702803205670c',1,'cv::cudev::sin(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga603ead4205bbc200a0f1c7eb2894a3a7',1,'cv::cudev::sin(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d00db800f05fc15be653fd37d4380e4',1,'cv::cudev::sin(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f96ddc1a5114686c3a916de5d4a2dbb',1,'cv::cudev::sin(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9a4525a60ac6b9342aa440db3be7cbc',1,'cv::cudev::sin(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90c83f6fdb6e0cf40a0fd5960e1597cb',1,'cv::cudev::sin(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga915d35b330bdfe06327511373de2cd6f',1,'cv::cudev::sin(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e3378e56015ebf4fee733ffe8546e78',1,'cv::cudev::sin(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d987301b57d2a3e0f6effc19c062290',1,'cv::cudev::sin(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ead77b8219b1623b103970d7d2657b',1,'cv::cudev::sin(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab32dadaf27d00fd3ae420bfe2993b089',1,'cv::cudev::sin(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d5cc3d51b7df55c83dc6338cfc4b272',1,'cv::cudev::sin(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga609b61e646afc5ea47c8da0ed4af188a',1,'cv::cudev::sin(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40a71fd43839f68db29d5d3d9d991fe8',1,'cv::cudev::sin(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cfbafe094337f83a97d0884e8618c9',1,'cv::cudev::sin(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae04f739d259ae154cd26a39b5604f694',1,'cv::cudev::sin(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70aca1b22d401d2de7d7efc3323bca93',1,'cv::cudev::sin(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e004f45ce1d6e29fa3ccaea88d4ee80',1,'cv::cudev::sin(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72e7e4ab7f2f475737f808409ad5e41f',1,'cv::cudev::sin(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18a0f30cd4a933e15d636a5fee642cf7',1,'cv::cudev::sin(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae82be4ae62a43620e9d309c88fc2f96f',1,'cv::cudev::sin(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d64e2eb87abb7ae2364c7ee304014ba',1,'cv::cudev::sin(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc3ae5929000eb7f97153640ed2fe09',1,'cv::cudev::sin(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1841ebd92ea58d1ad61b78b3e7f90829',1,'cv::cudev::sin(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2ccede62049f156c6ddd6db49c438e6',1,'cv::cudev::sin(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2740282849b89e813cb302a1d0444aa',1,'cv::cudev::sin(const double2 &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad7c879b58f79ccd980f4ce13fe3db49a',1,'sin(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09521d0ba1e338a8709ba2b34191ece0',1,'sin(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2671b223cd6902850864586638c5ac23',1,'sin(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f147de79af702d8d4398a75a1521c41',1,'sin(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa65ebb1958aa6daaacb7e0b94810ff87',1,'sin(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ca6d7da7566d4fed9d0472b070bda3c',1,'sin(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40f69179231e1d9aec1e60bf3fd67744',1,'sin(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb37f9efcdb08d87d26702803205670c',1,'sin(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga603ead4205bbc200a0f1c7eb2894a3a7',1,'sin(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d00db800f05fc15be653fd37d4380e4',1,'sin(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f96ddc1a5114686c3a916de5d4a2dbb',1,'sin(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9a4525a60ac6b9342aa440db3be7cbc',1,'sin(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90c83f6fdb6e0cf40a0fd5960e1597cb',1,'sin(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga915d35b330bdfe06327511373de2cd6f',1,'sin(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e3378e56015ebf4fee733ffe8546e78',1,'sin(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d987301b57d2a3e0f6effc19c062290',1,'sin(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ead77b8219b1623b103970d7d2657b',1,'sin(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab32dadaf27d00fd3ae420bfe2993b089',1,'sin(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d5cc3d51b7df55c83dc6338cfc4b272',1,'sin(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga609b61e646afc5ea47c8da0ed4af188a',1,'sin(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40a71fd43839f68db29d5d3d9d991fe8',1,'sin(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cfbafe094337f83a97d0884e8618c9',1,'sin(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae04f739d259ae154cd26a39b5604f694',1,'sin(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70aca1b22d401d2de7d7efc3323bca93',1,'sin(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e004f45ce1d6e29fa3ccaea88d4ee80',1,'sin(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72e7e4ab7f2f475737f808409ad5e41f',1,'sin(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18a0f30cd4a933e15d636a5fee642cf7',1,'sin(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae82be4ae62a43620e9d309c88fc2f96f',1,'sin(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d64e2eb87abb7ae2364c7ee304014ba',1,'sin(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc3ae5929000eb7f97153640ed2fe09',1,'sin(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1841ebd92ea58d1ad61b78b3e7f90829',1,'sin(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2ccede62049f156c6ddd6db49c438e6',1,'sin(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2740282849b89e813cb302a1d0444aa',1,'sin(const double2 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga249915bcbce6563e63f5ffa6d464155a',1,'std::sin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga249915bcbce6563e63f5ffa6d464155a',1,'sin()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae6e8ad270ff41c088d7651567594f796',1,'Eigen::sin()']]], - ['sin_5f_1182',['sin_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b2f2547ca8e9c510526423826cdc3d6',1,'cv::cudev::sin_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b2f2547ca8e9c510526423826cdc3d6',1,'sin_()(Global Namespace)']]], - ['sin_5ffunc_1183',['sin_func',['https://docs.opencv.org/4.2.0/d1/d05/structcv_1_1cudev_1_1sin__func.html',1,'cv::cudev']]], - ['sin_5ffunc_3c_20double_20_3e_1184',['sin_func< double >',['https://docs.opencv.org/4.2.0/d8/d1c/structcv_1_1cudev_1_1sin__func_3_01double_01_4.html',1,'cv::cudev']]], - ['sin_5ffunc_3c_20float_20_3e_1185',['sin_func< float >',['https://docs.opencv.org/4.2.0/d6/d2b/structcv_1_1cudev_1_1sin__func_3_01float_01_4.html',1,'cv::cudev']]], - ['sin_5ffunc_3c_20schar_20_3e_1186',['sin_func< schar >',['https://docs.opencv.org/4.2.0/d8/d1b/structcv_1_1cudev_1_1sin__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['sin_5ffunc_3c_20short_20_3e_1187',['sin_func< short >',['https://docs.opencv.org/4.2.0/dd/d6f/structcv_1_1cudev_1_1sin__func_3_01short_01_4.html',1,'cv::cudev']]], - ['sin_5ffunc_3c_20uchar_20_3e_1188',['sin_func< uchar >',['https://docs.opencv.org/4.2.0/d2/dfd/structcv_1_1cudev_1_1sin__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['sin_5ffunc_3c_20uint_20_3e_1189',['sin_func< uint >',['https://docs.opencv.org/4.2.0/d5/dbd/structcv_1_1cudev_1_1sin__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['sin_5ffunc_3c_20ushort_20_3e_1190',['sin_func< ushort >',['https://docs.opencv.org/4.2.0/d8/d22/structcv_1_1cudev_1_1sin__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['single_20output_1191',['Upscaling images: single-output',['https://docs.opencv.org/4.2.0/d5/d29/tutorial_dnn_superres_upscale_image_single.html',1,'']]], - ['singleclientwsserver_1192',['SingleClientWSServer',['../classnet_1_1websocket_1_1SingleClientWSServer.html',1,'net::websocket::SingleClientWSServer'],['../classnet_1_1websocket_1_1SingleClientWSServer.html#ac665bc5e8ae3112c4471b1352ddb2132',1,'net::websocket::SingleClientWSServer::SingleClientWSServer()']]], - ['singledimtrapezoidalvelocityprofile_1193',['SingleDimTrapezoidalVelocityProfile',['../classcontrol_1_1SingleDimTrapezoidalVelocityProfile.html',1,'control::SingleDimTrapezoidalVelocityProfile'],['../classcontrol_1_1SingleDimTrapezoidalVelocityProfile.html#a110579aeecbe2f5624ba3157af0712c7',1,'control::SingleDimTrapezoidalVelocityProfile::SingleDimTrapezoidalVelocityProfile()']]], - ['singlefeed_1194',['singleFeed',['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#aededd4813e3e2d35f79c04ac40fea9e3',1,'cv::detail::GainCompensator']]], - ['singlefpconfig_1195',['singleFPConfig',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a46207d759e1e39f0d64ccbac7bd444de',1,'cv::ocl::Device']]], - ['singlemaskchannels_1196',['SingleMaskChannels',['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html',1,'cv::cudev']]], - ['singlemaskchannels_1197',['singleMaskChannels',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a875afea6eef58cd5bd1ceb2d38ed96',1,'cv::cudev::singleMaskChannels()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a875afea6eef58cd5bd1ceb2d38ed96',1,'singleMaskChannels()(Global Namespace)']]], - ['singlemaskchannelssz_1198',['SingleMaskChannelsSz',['https://docs.opencv.org/4.2.0/d0/d19/structcv_1_1cudev_1_1SingleMaskChannelsSz.html',1,'cv::cudev']]], - ['singular_20value_20matrix_20decomposition_1199',['Singular value matrix decomposition',['https://docs.opencv.org/4.2.0/dd/d2a/group__core__hal__interface__decomp__svd.html',1,'']]], - ['singularvalues_1200',['singularValues',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a4e7bac123570c348f7ed6be909e1e474',1,'Eigen::SVDBase::singularValues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a4e7bac123570c348f7ed6be909e1e474',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::singularValues()']]], - ['sinh_1201',['sinh',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9c37eab2dc7baf83809269254c9129e0',1,'Eigen::MatrixBase::sinh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9c37eab2dc7baf83809269254c9129e0',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sinh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9c37eab2dc7baf83809269254c9129e0',1,'MatrixBase< Solve< Decomposition, RhsType > >::sinh()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772d44272d0bd7c7b67f16ea0b85cb80',1,'cv::cudev::sinh(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga344edc16853d27c854368f389d416065',1,'cv::cudev::sinh(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41fc9242b7523253e30be1597ee66ae',1,'cv::cudev::sinh(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddc053cb31f1c990c61111d1c6743dc2',1,'cv::cudev::sinh(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ca9a17c7a0fc5a6482d44925904591',1,'cv::cudev::sinh(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07e2a3dbaccc0f8545a04c2981b6893c',1,'cv::cudev::sinh(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga041bd4a026295d1ecd49292b72bcd9b0',1,'cv::cudev::sinh(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbfadd781ca9a813fc846d412e1bb8cb',1,'cv::cudev::sinh(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f6b210903dc62269c50728eac20a3f',1,'cv::cudev::sinh(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab486c1024c95760571e684fb39a2ee85',1,'cv::cudev::sinh(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa81c2145a67198bd56929f430f2278b2',1,'cv::cudev::sinh(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931ce3aa6bc08deb00c50fb03bf47ed3',1,'cv::cudev::sinh(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b71a067f79c91cc5f62b5f422b09c9',1,'cv::cudev::sinh(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1669c360c5924edd756ae9d9536eb8e4',1,'cv::cudev::sinh(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487d5848e17ac161e3776eecf48adcf6',1,'cv::cudev::sinh(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad385a12228a01205ba34ea7926f407a0',1,'cv::cudev::sinh(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1eaa0ad7b95a36a271c0afbbd8d7a0a',1,'cv::cudev::sinh(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87c9882d3f6d3ea06cf957fecceb1af1',1,'cv::cudev::sinh(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5162f3f12ea498b9fcc5a843ed6112cd',1,'cv::cudev::sinh(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4abff00111b20ef9070fd6c52ff6c4',1,'cv::cudev::sinh(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d6389dea5e2a1eee144bade28064c6',1,'cv::cudev::sinh(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b36fcf77ae7d883572908e070ef4b8c',1,'cv::cudev::sinh(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga693a5fecbc38f4ab58b6e42a5b26c711',1,'cv::cudev::sinh(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f05f7337e5c6b1ee245f37182398e51',1,'cv::cudev::sinh(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa641ed89c52fc91f854112ab277934ee',1,'cv::cudev::sinh(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5ae3dd563be525b52f9d614b44b0008',1,'cv::cudev::sinh(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb23dca771a80de9a2629878d60385e',1,'cv::cudev::sinh(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac10c00f0dc12cd8e4eeaad51330251bf',1,'cv::cudev::sinh(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e573cff24de567a8d3c8215ec25a686',1,'cv::cudev::sinh(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1372528a6d841534331bdd0270d9b87f',1,'cv::cudev::sinh(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac5d6219259ed327d126311d05f3f77d',1,'cv::cudev::sinh(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8a3df5e8a2b664bec6d194a8efc1b11',1,'cv::cudev::sinh(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772d44272d0bd7c7b67f16ea0b85cb80',1,'sinh(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga344edc16853d27c854368f389d416065',1,'sinh(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41fc9242b7523253e30be1597ee66ae',1,'sinh(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddc053cb31f1c990c61111d1c6743dc2',1,'sinh(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ca9a17c7a0fc5a6482d44925904591',1,'sinh(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07e2a3dbaccc0f8545a04c2981b6893c',1,'sinh(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga041bd4a026295d1ecd49292b72bcd9b0',1,'sinh(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbfadd781ca9a813fc846d412e1bb8cb',1,'sinh(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f6b210903dc62269c50728eac20a3f',1,'sinh(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab486c1024c95760571e684fb39a2ee85',1,'sinh(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa81c2145a67198bd56929f430f2278b2',1,'sinh(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931ce3aa6bc08deb00c50fb03bf47ed3',1,'sinh(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b71a067f79c91cc5f62b5f422b09c9',1,'sinh(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1669c360c5924edd756ae9d9536eb8e4',1,'sinh(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487d5848e17ac161e3776eecf48adcf6',1,'sinh(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad385a12228a01205ba34ea7926f407a0',1,'sinh(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1eaa0ad7b95a36a271c0afbbd8d7a0a',1,'sinh(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87c9882d3f6d3ea06cf957fecceb1af1',1,'sinh(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5162f3f12ea498b9fcc5a843ed6112cd',1,'sinh(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4abff00111b20ef9070fd6c52ff6c4',1,'sinh(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d6389dea5e2a1eee144bade28064c6',1,'sinh(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b36fcf77ae7d883572908e070ef4b8c',1,'sinh(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga693a5fecbc38f4ab58b6e42a5b26c711',1,'sinh(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f05f7337e5c6b1ee245f37182398e51',1,'sinh(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa641ed89c52fc91f854112ab277934ee',1,'sinh(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5ae3dd563be525b52f9d614b44b0008',1,'sinh(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb23dca771a80de9a2629878d60385e',1,'sinh(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac10c00f0dc12cd8e4eeaad51330251bf',1,'sinh(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e573cff24de567a8d3c8215ec25a686',1,'sinh(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1372528a6d841534331bdd0270d9b87f',1,'sinh(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac5d6219259ed327d126311d05f3f77d',1,'sinh(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8a3df5e8a2b664bec6d194a8efc1b11',1,'sinh(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae30c461aa90a3e7d502737e29898570b',1,'std::sinh()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae30c461aa90a3e7d502737e29898570b',1,'sinh()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af284ce359b6efd4b594a9f8a1f5e5d96',1,'Eigen::sinh()']]], - ['sinh_5f_1202',['sinh_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5670821e2cf464830fdd577155c97682',1,'cv::cudev::sinh_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5670821e2cf464830fdd577155c97682',1,'sinh_()(Global Namespace)']]], - ['sinh_5ffunc_1203',['sinh_func',['https://docs.opencv.org/4.2.0/d8/da0/structcv_1_1cudev_1_1sinh__func.html',1,'cv::cudev']]], - ['sinh_5ffunc_3c_20double_20_3e_1204',['sinh_func< double >',['https://docs.opencv.org/4.2.0/db/dde/structcv_1_1cudev_1_1sinh__func_3_01double_01_4.html',1,'cv::cudev']]], - ['sinh_5ffunc_3c_20float_20_3e_1205',['sinh_func< float >',['https://docs.opencv.org/4.2.0/d3/df1/structcv_1_1cudev_1_1sinh__func_3_01float_01_4.html',1,'cv::cudev']]], - ['sinh_5ffunc_3c_20schar_20_3e_1206',['sinh_func< schar >',['https://docs.opencv.org/4.2.0/de/df6/structcv_1_1cudev_1_1sinh__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['sinh_5ffunc_3c_20short_20_3e_1207',['sinh_func< short >',['https://docs.opencv.org/4.2.0/da/d3e/structcv_1_1cudev_1_1sinh__func_3_01short_01_4.html',1,'cv::cudev']]], - ['sinh_5ffunc_3c_20uchar_20_3e_1208',['sinh_func< uchar >',['https://docs.opencv.org/4.2.0/d4/dd2/structcv_1_1cudev_1_1sinh__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['sinh_5ffunc_3c_20uint_20_3e_1209',['sinh_func< uint >',['https://docs.opencv.org/4.2.0/de/d13/structcv_1_1cudev_1_1sinh__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['sinh_5ffunc_3c_20ushort_20_3e_1210',['sinh_func< ushort >',['https://docs.opencv.org/4.2.0/d9/d38/structcv_1_1cudev_1_1sinh__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['sinus_1211',['SINUS',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#ggaf0af0db4c870be3ef86132870821d452a2b23baf7ce23f7583fe2a584728b77ae',1,'cv::ft::SINUS'],['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#ggaf0af0db4c870be3ef86132870821d452a2b23baf7ce23f7583fe2a584728b77ae',1,'SINUS(Global Namespace)']]], - ['sinusoidal_20pattern_20tutorial_1212',['Capture Sinusoidal pattern tutorial',['https://docs.opencv.org/4.2.0/d0/de8/tutorial_capture_sinusoidal_pattern.html',1,'']]], - ['sinusoidalpattern_1213',['SinusoidalPattern',['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1structured__light_1_1SinusoidalPattern.html',1,'cv::structured_light']]], - ['sinusoidalpattern_2ehpp_1214',['sinusoidalpattern.hpp',['https://docs.opencv.org/4.2.0/d5/de0/sinusoidalpattern_8hpp.html',1,'']]], - ['size_1215',['Size',['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html',1,'cv::gapi::own']]], - ['size_1216',['size',['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#a0aa1b9d10cb5790c13977c7ef3d60589',1,'cv::BOWTrainer::size'],['https://docs.opencv.org/4.2.0/d9/daa/structcvhalKeyPoint.html#a595113ae7b221433c941ed1bf1fcfc74',1,'cvhalKeyPoint::size'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#a57434b53bae97ab6bedbb134acadc22b',1,'cv::detail::DisjointSets::size'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a76b5615e48bff202e58eb1943d50d499',1,'cv::GMatDesc::size'],['https://docs.opencv.org/4.2.0/d9/d8b/structhashtable__int.html#af2fcd9f790e42fd58daef178dcd7ad49',1,'hashtable_int::size'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#ac90d9bd519dc9d1c1c03bac053f5293a',1,'cv::SparseMat::Hdr::size'],['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a3d23124ae5d210ba5ba5faebf5e89f3c',1,'cv::line_descriptor::KeyLine::size'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#a308006c9f963547a8cff61548ddd2ef2',1,'cv::KeyPoint::size'],['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#a04afb9bb9e17c59094a2b1e2a87e44b9',1,'cv::dnn::LRNLayer::size'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a146f8e8dda07d1365a575ab83d9828d1',1,'cv::Mat::size'],['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a42ec820537c8749494a65784dbb44261',1,'cv::NAryMatIterator::size'],['https://docs.opencv.org/4.2.0/d2/d12/structNCVMemSegment.html#a376bdfb501e8f18ba89e4966e1d76ae8',1,'NCVMemSegment::size'],['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#aa31c426771eec1a37fb4b916671c92a9',1,'NppStInterpolationState::size'],['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#a1c3369153b15c7f673d2afd5b07a55c1',1,'cv::videostab::RansacParams::size'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a68ac6414ed3233245175e2c4f3b2bbfb',1,'cv::RotatedRect::size'],['https://docs.opencv.org/4.2.0/dd/d08/structcv_1_1cudev_1_1TupleTraits.html#a4b22d3c775a55301f774790aacd5cc44ab44ae6417c21f32d2d7d5e9fe9c970d7',1,'cv::cudev::TupleTraits::size'],['https://docs.opencv.org/4.2.0/d2/dae/structcv_1_1cudev_1_1TupleTraits_3_01tuple_3_01P0_00_01P1_00_01P2_00_01P3_00_01P4_00_01P5_00_01P41642a2d25b95a5ddb87ca2004b28336.html#a5b3f0e699ccd1c7722a083dbd5c90c9ba0797302a76304c5e3772a9680585391e',1,'cv::cudev::TupleTraits< tuple< P0, P1, P2, P3, P4, P5, P6, P7, P8, P9 > >::size'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a762e5567b5c5636f6c1de2c260b12065',1,'cv::UMat::size'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#ab3bf7b4c0a3f1206def1008d9f9150ba',1,'cv::UMatData::size'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0d8ed64f7bbbda6d34e3289681ffdff0',1,'cv::_InputArray::size()'],['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a6f9bc2bcf2fed70c4a6b49f62b7b01bd',1,'cv::ogl::Arrays::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'cv::AutoBuffer::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'AutoBuffer< double, 1 >::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'AutoBuffer< int64, 1 >::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'AutoBuffer< String, 1 >::size()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#af627f6025672dcd3f054667da63f6ae1',1,'cv::ogl::Buffer::size()'],['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a18e35a5bce978c5729ef5ea58b1fee28',1,'cv::DescriptorMatcher::DescriptorCollection::size()'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#addb04c93f4b075a6343d62222f446afc',1,'cv::dnn::DictValue::size()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a05c11e00d20223cde61677de91c71197',1,'cv::FileNode::size()'],['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1flann_1_1GenericIndex.html#affe04ca85a1e20d655ad972ba9b3d72a',1,'cv::flann::GenericIndex::size()'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#aaf653cfda76e2067c792290d509d2fc5',1,'cv::gapi::GKernelPackage::size()'],['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#a111ea435bae91141a418e9ce8f5f31b2',1,'cv::optflow::GPCTrainingSamples::size()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ab02f97698d8272f0d253f3029329ed10',1,'cv::cuda::GpuMat::size()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#aa61acd6d1db2ec950221831dc3fe1ca9',1,'cv::cuda::HostMem::size()'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1tbm_1_1IImageDescriptor.html#a9217032891d76e5e4b1b153af86ec275',1,'cv::tbm::IImageDescriptor::size()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8b5fcf3cec72903e2692e5c71e1c283b',1,'cv::MatExpr::size()'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a80309fab69773987e1c740279b82abd1',1,'cv::MatOp::size()'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#a78d401af8024a6bdacde4886a5538dbe',1,'NCVMatrix::size()'],['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#a202fc148a0ad8df135215ecf1781a0b8',1,'cv::Range::size()'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#ab0c92d80e25e22be48c0110c5200da1e',1,'cv::Rect_::size()'],['https://docs.opencv.org/4.2.0/d5/d34/classcv_1_1tbm_1_1ResizedImageDescriptor.html#a73954a1918519059b34189e3792b4559',1,'cv::tbm::ResizedImageDescriptor::size()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a65eac830987646a4792815ad4e717c3e',1,'cv::SparseMat::size() const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a4fe9c986b3cf0240c68ce985df334c17',1,'cv::SparseMat::size(int i) const'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a65f84b8b7f310fa80d6ca0e1e80be492',1,'cv::ogl::Texture2D::size()'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a57cc6b1a08cb876f8aecc76a4051763c',1,'cv::tbm::Track::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a942b15c04edb2c0c0635d22b50dfa338',1,'__gnu_cxx::__versa_string::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a9bc2a952203a764d5a1cdf80f94bd2a8',1,'__gnu_cxx::temporary_buffer::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'__gnu_debug::basic_string::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< _CharT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< _CharT, _Traits, _Allocator >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< char >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< char, char_traits< char >, _Byte_alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< char_type, _Traits, _Alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< value_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a24d5150e384f657ca3b317ced4dadc5d',1,'deque< _StateSeqT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4b6c305dd92e3c76213778feba213da2',1,'list< __inp, __rebind_inp >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a2ceef4213eb87e16e8fe124fa54a7ea7',1,'match_results< _Bi_iter >::size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a2ceef4213eb87e16e8fe124fa54a7ea7',1,'match_results< _Bi_iter >::size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a625c78a7dc1b563f9754e33879243f4e',1,'stack< _StateSeqT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a9bc2a952203a764d5a1cdf80f94bd2a8',1,'std::_Temporary_buffer::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'std::basic_string::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#acae6b747171db72a7f5b80f698972874',1,'std::bitset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a24d5150e384f657ca3b317ced4dadc5d',1,'std::deque::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaeabfccb9dc90c70b63e73149b026ccf5',1,'std::gslice::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4b6c305dd92e3c76213778feba213da2',1,'std::list::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ab8dd27409135bbee5bb626cd72e0cddb',1,'std::map::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a2ceef4213eb87e16e8fe124fa54a7ea7',1,'std::match_results::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a99416d1336342563c08a44ad664c74a3',1,'std::multimap::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aa0d42b46c75769cbce93494ac80c8c34',1,'std::multiset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#a22575e222bea1d4bdd5e978b2d6c3b04',1,'std::priority_queue::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#a39a435e44d6ff36f98f21dc45a2ac7f0',1,'std::queue::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab21409945167dfbfd999f005739cbc2a',1,'std::set::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5b1a5398fdc4ecf20576f3cae02ea8fc',1,'std::slice::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a625c78a7dc1b563f9754e33879243f4e',1,'std::stack::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aa80249a927b88d3e03afce4993630c17',1,'std::tr2::dynamic_bitset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d1de2c7389176716aceeaba3b1c2bb7',1,'std::unordered_map::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af02efb64c18107a5c4f13a1983cfa5a3',1,'std::unordered_multimap::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#acd836983ff93b793bf5404002ceac468',1,'std::unordered_multiset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a73ec5052e45a7a980d1968a0805a32dd',1,'std::unordered_set::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga351ffb24ad6654f7f5f8b10731fc8c95',1,'std::valarray::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'std::vector::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d1de2c7389176716aceeaba3b1c2bb7',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga351ffb24ad6654f7f5f8b10731fc8c95',1,'valarray< size_t >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< __diff_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _CharClassT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _CharT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _Cmpt >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _Node *, _Nodeptr_Alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _RealType >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _State< _TraitsT::char_type > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _StringT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< block_type, allocator_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< Catalog_info * >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< double >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< int >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< result_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< size_t >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< std::pair< _BiIter, int > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< std::pair< _StateIdT, std::vector > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< std::pair< _StrTransT, _StrTransT > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< sub_match< _Bi_iter >, _Alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< sub_match< _BiIter >, _Alloc >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArithmeticSequence.html#a59c45682aae07a2ce72f7781b420c0d6',1,'Eigen::ArithmeticSequence::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::EigenBase::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< FullPivLU< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< HouseholderQR< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Inverse< PermutationType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< LLT< _MatrixType, _UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PartialPivLU< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PermutationWrapper< _IndicesType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SVDBase< Derived > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Transpose< MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< TriangularView< MatrixType, Mode > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'Eigen::PermutationBase::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< PermutationWrapper< _IndicesType > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'Eigen::SparseMatrixBase::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< Transpose< MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::size()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a33c7c8638bb0b12e6d1b69d8106dd2e0.html#a33c7c8638bb0b12e6d1b69d8106dd2e0',1,'nlohmann::basic_json::size()']]], - ['size_1217',['Size',['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#a414d94d96776dd293fadcccc8bb8d945',1,'cv::gapi::own::Size::Size()=default'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#ad47bebdef94e1a54723cd603a0cad05a',1,'cv::gapi::own::Size::Size(int _width, int _height)'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#aa209bef3a32994815d6e6a431f2c4d79',1,'cv::gapi::own::Size::Size(const cv::Size &other)']]], - ['size_1218',['size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5b1a5398fdc4ecf20576f3cae02ea8fc',1,]]], - ['size_1219',['Size',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga346f563897249351a34549137c8532a0',1,'cv::Size'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga346f563897249351a34549137c8532a0',1,'Size(Global Namespace)']]], - ['size_20vectorizable_20eigen_20objects_1220',['Fixed-size vectorizable Eigen objects',['https://eigen.tuxfamily.org/dox/group__TopicFixedSizeVectorizable.html',1,'']]], - ['size2d_1221',['Size2d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaff96e5bec8019ca9917fd1e4c0cf8267',1,'cv::Size2d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaff96e5bec8019ca9917fd1e4c0cf8267',1,'Size2d(Global Namespace)']]], - ['size2f_1222',['Size2f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gab34496d2466b5f69930ab74c70f117d4',1,'cv::Size2f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gab34496d2466b5f69930ab74c70f117d4',1,'Size2f(Global Namespace)']]], - ['size2i_1223',['Size2i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5ef7f5978948e0cb3c3a3d4172594aec',1,'cv::Size2i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5ef7f5978948e0cb3c3a3d4172594aec',1,'Size2i(Global Namespace)']]], - ['size2l_1224',['Size2l',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga153b6b90ce30f84239c9a39613e836d3',1,'cv::Size2l'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga153b6b90ce30f84239c9a39613e836d3',1,'Size2l(Global Namespace)']]], - ['size_5f_1225',['Size_',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html',1,'cv::Size_< _Tp >'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae09ae11fd75a16928ca40980ad46a9bf',1,'cv::Size_::Size_()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a45c97e9a4930d73fde11c2acc5f371ac',1,'cv::Size_::Size_(_Tp _width, _Tp _height)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#abe760f15bf01a0ee3f51d81f4f8ea259',1,'cv::Size_::Size_(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae220b36673041edafc81c0e9677eb609',1,'cv::Size_::Size_(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2c6d59e6fe58dc2cda78504271b7ec6c',1,'cv::Size_::Size_(const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae09ae11fd75a16928ca40980ad46a9bf',1,'Size_< float >::Size_()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a45c97e9a4930d73fde11c2acc5f371ac',1,'Size_< float >::Size_(float _width, float _height)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#abe760f15bf01a0ee3f51d81f4f8ea259',1,'Size_< float >::Size_(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae220b36673041edafc81c0e9677eb609',1,'Size_< float >::Size_(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2c6d59e6fe58dc2cda78504271b7ec6c',1,'Size_< float >::Size_(const Point_< float > &pt)']]], - ['size_5f_3c_20float_20_3e_1226',['Size_< float >',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html',1,'']]], - ['size_5ffn_5fimps_2ehpp_1227',['size_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01292.html',1,'']]], - ['size_5frow_1228',['SIZE_ROW',['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#a2be14e0142d3c05eb8f7fd101da897b2',1,'cv::cuda::ORB::SIZE_ROW'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a3b5156553e52661b04bf02fa9628f746afab69397159f91277ff725c76b2cdcba',1,'cv::cuda::SURF_CUDA::SIZE_ROW']]], - ['size_5ftype_1229',['size_type',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a23e0cc13f851ac190d768b12c3dae3b1',1,'cv::Allocator::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11171.html#a74744bfab3764b78a3cf339de9479a80',1,'__gnu_pbds::hash_prime_size_policy::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11787.html#af4fea3ec891b02cccd88355a969c90ba',1,'__gnu_pbds::sample_range_hashing::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#afa708b47ccdbdfd9e35edc2121fd2d89',1,'__gnu_pbds::sample_resize_policy::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a201fc8206c4854233d6290f37c35458b',1,'__gnu_pbds::sample_resize_trigger::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12015.html#a655a04ece92c1f5542fdf3f89c934c07',1,'__gnu_pbds::sample_size_policy::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#acb7ab4835031bde4cbf2787c341b7cb7',1,'__gnu_pbds::trie_prefix_search_node_update::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a528d5c1afff59af1a90aa9273dddb806',1,'allocator_traits< _Tp_alloc_type >::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a528d5c1afff59af1a90aa9273dddb806',1,'std::allocator_traits::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#af1836ee16fd652969eb06007c273edd0',1,'std::allocator_traits< allocator< _Tp > >::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ad9837325cd001566e32eb95539a8ded5',1,'std::set::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ad9837325cd001566e32eb95539a8ded5',1,'std::set::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acefc3dbfc16b70562f92193d01156479',1,'std::unordered_map::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acefc3dbfc16b70562f92193d01156479',1,'std::unordered_map::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ab9e187c541bf3fe290dd21b514abd024',1,'std::unordered_multimap::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ab9e187c541bf3fe290dd21b514abd024',1,'std::unordered_multimap::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a530f5c88d1e5082a61c5b38948e1cfdb',1,'std::unordered_multiset::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a530f5c88d1e5082a61c5b38948e1cfdb',1,'std::unordered_multiset::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a489606b8c31cc86a461912f292dac389',1,'std::unordered_set::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a489606b8c31cc86a461912f292dac389',1,'std::unordered_set::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acefc3dbfc16b70562f92193d01156479',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acefc3dbfc16b70562f92193d01156479',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::size_type'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3ada29bca70b4965f6fd37ec1c8f85f7.html#a3ada29bca70b4965f6fd37ec1c8f85f7',1,'nlohmann::basic_json::size_type']]], - ['sizeatcompiletime_1230',['SizeAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da25cb495affdbd796198462b8ef06be91',1,'Eigen::DenseBase::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da25cb495affdbd796198462b8ef06be91',1,'DenseBase< ArrayWrapper< ExpressionType > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da25cb495affdbd796198462b8ef06be91',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da25cb495affdbd796198462b8ef06be91',1,'DenseBase< Solve< Decomposition, RhsType > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1aa5022cfa2bb53129883e9b7b8abd3d68',1,'Eigen::SparseMatrixBase::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1aa5022cfa2bb53129883e9b7b8abd3d68',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1aa5022cfa2bb53129883e9b7b8abd3d68',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1aa5022cfa2bb53129883e9b7b8abd3d68',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1aa5022cfa2bb53129883e9b7b8abd3d68',1,'SparseMatrixBase< Transpose< MatrixType > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1aa5022cfa2bb53129883e9b7b8abd3d68',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a687d3c44b9eaf8adac51d1ed796ba4f0a41d03efb5f764a9e647974c83581ca0e',1,'Eigen::TriangularBase::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a687d3c44b9eaf8adac51d1ed796ba4f0a41d03efb5f764a9e647974c83581ca0e',1,'TriangularBase< SelfAdjointView< _MatrixType, UpLo > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a687d3c44b9eaf8adac51d1ed796ba4f0a41d03efb5f764a9e647974c83581ca0e',1,'TriangularBase< SelfAdjointView< const Derived, UpLo > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a687d3c44b9eaf8adac51d1ed796ba4f0a41d03efb5f764a9e647974c83581ca0e',1,'TriangularBase< TriangularView< _MatrixType, _Mode > >::SizeAtCompileTime']]], - ['sizend_1231',['sizend',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7cb4cadf3108dc232e05e3ae5550e912',1,'cv::_InputArray']]], - ['sizes_1232',['sizes',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a4d0f2228231a351280a1b14b1915fe7b',1,'Eigen::AlignedBox']]], - ['sizes_5f_1233',['sizes_',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a5abe230ead5af1b35d94cb3f2b867787',1,'cv::detail::PairwiseSeamFinder']]], - ['skeleton_1234',['skeleton',['https://docs.opencv.org/4.2.0/d4/d66/structcv_1_1datasets_1_1skeleton.html',1,'cv::datasets']]], - ['skeletons_1235',['skeletons',['https://docs.opencv.org/4.2.0/d3/dad/structcv_1_1datasets_1_1GR__chalearnObj.html#a1b1069e0014fda9b87792e0932d67ef8',1,'cv::datasets::GR_chalearnObj']]], - ['skew_1236',['skew',['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga281f0a5a7375c577d33672cb33604718',1,'cv::sfm::skew()'],['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga281f0a5a7375c577d33672cb33604718',1,'skew(InputArray x)(Global Namespace)']]], - ['skip_5fexisting_1237',['skip_existing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a061f6d61eab01c92e56fcac8789b6b9d',1,'skip_existing(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a061f6d61eab01c92e56fcac8789b6b9d',1,'skip_existing(Global Namespace)']]], - ['skip_5fsymlinks_1238',['skip_symlinks',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298aef4a262c2a436cce67818b680933529e',1,'skip_symlinks(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298aef4a262c2a436cce67818b680933529e',1,'skip_symlinks(Global Namespace)']]], - ['skipjunk_1239',['skipJunk',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ab175c66eb8d1e86abeaa1fc2203e70d5',1,'cv::AVIReadContainer::skipJunk(RiffChunk &chunk)'],['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ad5800e79427105fdb22f9819f83c245b',1,'cv::AVIReadContainer::skipJunk(RiffList &list)']]], - ['skipws_1240',['skipws',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'basic_ios< char, _Traits >::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'basic_iostream< char >::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'basic_istream< char >::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'basic_istream< char, _Traits >::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'basic_ostream< char >::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'basic_ostream< char, _Traits >::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_fstream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_ifstream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_ios::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_iostream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_istream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_istringstream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_ofstream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_ostream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_ostringstream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_stringstream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::ios_base::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad458fa76ad203ae00a0fb1c602ec1cf6',1,'std::skipws()']]], - ['sl2_1241',['SL2',['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html',1,'cv']]], - ['slam_1242',['SLAM',['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html',1,'']]], - ['slam_5fkitti_1243',['SLAM_kitti',['https://docs.opencv.org/4.2.0/d6/d92/classcv_1_1datasets_1_1SLAM__kitti.html',1,'cv::datasets']]], - ['slam_5fkitti_2ehpp_1244',['slam_kitti.hpp',['https://docs.opencv.org/4.2.0/dc/d1e/slam__kitti_8hpp.html',1,'']]], - ['slam_5fkittiobj_1245',['SLAM_kittiObj',['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html',1,'cv::datasets']]], - ['slam_5ftumindoor_1246',['SLAM_tumindoor',['https://docs.opencv.org/4.2.0/da/d91/classcv_1_1datasets_1_1SLAM__tumindoor.html',1,'cv::datasets']]], - ['slam_5ftumindoor_2ehpp_1247',['slam_tumindoor.hpp',['https://docs.opencv.org/4.2.0/df/d91/slam__tumindoor_8hpp.html',1,'']]], - ['slam_5ftumindoorobj_1248',['SLAM_tumindoorObj',['https://docs.opencv.org/4.2.0/d7/d56/structcv_1_1datasets_1_1SLAM__tumindoorObj.html',1,'cv::datasets']]], - ['sleep_5ffor_1249',['sleep_for',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01566.html#a7ddb6a2d48e0bb2cace6dd67c4c38596',1,'std::this_thread']]], - ['sleep_5funtil_1250',['sleep_until',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01566.html#a277096a2cdd1fc66b7569f457b731bfb',1,'std::this_thread']]], - ['slerp_1251',['slerp',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'Eigen::QuaternionBase::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ab9ceb217d03c6a2a6438be37a3ccd855',1,'Eigen::Rotation2D::slerp()']]], - ['slic_1252',['SLIC',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gga6c6f7deab0bd328066f0ada72c2ce57ba14bff8b90df89890367525f0de4f3409',1,'cv::ximgproc::SLIC'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gga6c6f7deab0bd328066f0ada72c2ce57ba14bff8b90df89890367525f0de4f3409',1,'SLIC(Global Namespace)']]], - ['slic_2ehpp_1253',['slic.hpp',['https://docs.opencv.org/4.2.0/df/d2b/slic_8hpp.html',1,'']]], - ['slice_1254',['slice',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07115.html',1,'std::slice'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6a83c2410180b69ca38a2da2c4c984b9',1,'std::slice::slice()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9cc9983faafa145460d264127f7fd816',1,'std::slice::slice(size_t __o, size_t __d, size_t __s)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#ae14f6407db835831e8d5b8cc3693b808',1,'cv::dnn::slice(const Mat &m, const _Range &r0)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a72905f90ed70aefb3146201c774e6538',1,'cv::dnn::slice(const Mat &m, const _Range &r0, const _Range &r1)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a40066b7362eb3f88901507fbc44087d7',1,'cv::dnn::slice(const Mat &m, const _Range &r0, const _Range &r1, const _Range &r2)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#ac81609723c58d6db31a2b046a02e3311',1,'cv::dnn::slice(const Mat &m, const _Range &r0, const _Range &r1, const _Range &r2, const _Range &r3)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6a83c2410180b69ca38a2da2c4c984b9',1,'slice()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9cc9983faafa145460d264127f7fd816',1,'slice(size_t __o, size_t __d, size_t __s)(Global Namespace)']]], - ['slice_5farray_1255',['slice_array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04651.html',1,'std::slice_array< _Tp >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga886109b8edc60759a1c07ed209bf6110',1,'std::slice_array::slice_array()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga886109b8edc60759a1c07ed209bf6110',1,'slice_array(const slice_array &)(Global Namespace)']]], - ['slice_5farray_2eh_1256',['slice_array.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00512.html',1,'']]], - ['sliceend_1257',['sliceEnd',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a135e544f96bb39f2fe713dfd1ab02d02',1,'cv::MatConstIterator']]], - ['slicelayer_1258',['SliceLayer',['https://docs.opencv.org/4.2.0/de/d61/classcv_1_1dnn_1_1SliceLayer.html',1,'cv::dnn']]], - ['sliceranges_1259',['sliceRanges',['https://docs.opencv.org/4.2.0/de/d61/classcv_1_1dnn_1_1SliceLayer.html#a958e398c3d89f75b8d2f14e54303401e',1,'cv::dnn::SliceLayer']]], - ['slicestart_1260',['sliceStart',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a0b9062870872eadbb5bdda0580e3ea3f',1,'cv::MatConstIterator']]], - ['slicing_20and_20indexing_1261',['Slicing and Indexing',['https://eigen.tuxfamily.org/dox/group__TutorialSlicingIndexing.html',1,'']]], - ['slico_1262',['SLICO',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gga6c6f7deab0bd328066f0ada72c2ce57ba9b397d2eb2d75580b3a481bf8e0edef1',1,'cv::ximgproc::SLICO'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gga6c6f7deab0bd328066f0ada72c2ce57ba9b397d2eb2d75580b3a481bf8e0edef1',1,'SLICO(Global Namespace)']]], - ['slictype_1263',['SLICType',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#ga6c6f7deab0bd328066f0ada72c2ce57b',1,'cv::ximgproc::SLICType'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#ga6c6f7deab0bd328066f0ada72c2ce57b',1,'SLICType(Global Namespace)']]], - ['slist_1264',['slist',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09335.html',1,'__gnu_cxx::slist< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00869.html',1,'(Global Namespace)']]], - ['smallestangle_1265',['smallestAngle',['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ac648b9217d9f7ba4ee7a1a91aec8e46f',1,'Eigen::Rotation2D']]], - ['smallestpositiveangle_1266',['smallestPositiveAngle',['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a09c5195aa9a154551b2edf6ed4f22ab6',1,'Eigen::Rotation2D']]], - ['smallregionremoval_1267',['smallRegionRemoval',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a0c4797c9f4efff3dacc87a748bd05038',1,'cv::stereo::Matching']]], - ['smallwinsize_1268',['smallWinSize',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#ad84db18639f2f9f8a2287b05cb11aefd',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['smem_5ftuple_1269',['smem_tuple',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada9ddc5dd0880d539295fca6c71b1a43',1,'cv::cudev::smem_tuple(T0 *t0)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f5d4d674113e05e6e7634d0e4611d5',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a5947043131d608a3c093795baf5a2',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8498c67667e736f8669853bc01cdc2bf',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb9373e84cb0a13dd14cd4fa4aff4e1',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef4a5236e533195fafad8278b2c5e620',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af9cdcf327bd26e3bf201366508978c',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9438b5a9c4cf14df89be071081f959c',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadae9554fedac7876dee14809422714bc',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee998c9e69107c84770286d11ed10deb',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8, T9 *t9)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada9ddc5dd0880d539295fca6c71b1a43',1,'smem_tuple(T0 *t0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f5d4d674113e05e6e7634d0e4611d5',1,'smem_tuple(T0 *t0, T1 *t1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a5947043131d608a3c093795baf5a2',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8498c67667e736f8669853bc01cdc2bf',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb9373e84cb0a13dd14cd4fa4aff4e1',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef4a5236e533195fafad8278b2c5e620',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af9cdcf327bd26e3bf201366508978c',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9438b5a9c4cf14df89be071081f959c',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadae9554fedac7876dee14809422714bc',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee998c9e69107c84770286d11ed10deb',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8, T9 *t9)(Global Namespace)']]], - ['smoothing_20images_1270',['Smoothing Images',['https://docs.opencv.org/4.2.0/dc/dd3/tutorial_gausian_median_blur_bilateral_filter.html',1,'Smoothing Images'],['https://docs.opencv.org/4.2.0/d4/d13/tutorial_py_filtering.html',1,'Smoothing Images'],['https://docs.opencv.org/4.2.0/dd/d6a/tutorial_js_filtering.html',1,'Smoothing Images']]], - ['snextc_1271',['snextc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'__gnu_cxx::enc_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'__gnu_cxx::stdio_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'__gnu_cxx::stdio_sync_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_filebuf< char_type, traits_type >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_streambuf< _Elem, _Tr >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_streambuf< char, _Traits >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_streambuf< char, char_traits< char > >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::basic_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::basic_streambuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::basic_stringbuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::wbuffer_convert::snextc()']]], - ['sobel_1272',['Sobel',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gacea54f142e81b6758cb6f375ce782c8d',1,'cv::Sobel()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gae1443445c4cb3187dcf439a57cfa534f',1,'cv::gapi::Sobel()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gacea54f142e81b6758cb6f375ce782c8d',1,'Sobel(InputArray src, OutputArray dst, int ddepth, int dx, int dy, int ksize=3, double scale=1, double delta=0, int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gae1443445c4cb3187dcf439a57cfa534f',1,'Sobel(const GMat &src, int ddepth, int dx, int dy, int ksize=3, double scale=1, double delta=0, int borderType=BORDER_DEFAULT, const Scalar &borderValue=Scalar(0))(Global Namespace)']]], - ['sobel_20derivatives_1273',['Sobel Derivatives',['https://docs.opencv.org/4.2.0/d2/d2c/tutorial_sobel_derivatives.html',1,'']]], - ['sobel_5fderivatives_2emarkdown_1274',['sobel_derivatives.markdown',['https://docs.opencv.org/4.2.0/d8/d3a/sobel__derivatives_8markdown.html',1,'']]], - ['sobelx_5f_1275',['sobelX_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga945d37fbb4c7155744f8c05da3942cf7',1,'cv::cudev::sobelX_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga945d37fbb4c7155744f8c05da3942cf7',1,'sobelX_()(Global Namespace)']]], - ['sobelxptr_1276',['SobelXPtr',['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1SobelXPtr.html',1,'cv::cudev']]], - ['sobelxptr_1277',['sobelXPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73acbb3438525083fa2fa9d0295243de',1,'cv::cudev::sobelXPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73acbb3438525083fa2fa9d0295243de',1,'sobelXPtr()(Global Namespace)']]], - ['sobelxptrsz_1278',['SobelXPtrSz',['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1cudev_1_1SobelXPtrSz.html',1,'cv::cudev']]], - ['sobelxy_1279',['SobelXY',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga675a82fe875fb789e50dc17ab775f59b',1,'cv::gapi::SobelXY()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga675a82fe875fb789e50dc17ab775f59b',1,'SobelXY()(Global Namespace)']]], - ['sobely_5f_1280',['sobelY_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga279cba6bb715d130d5f267aa7aa8d8e0',1,'cv::cudev::sobelY_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga279cba6bb715d130d5f267aa7aa8d8e0',1,'sobelY_()(Global Namespace)']]], - ['sobelyptr_1281',['SobelYPtr',['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1SobelYPtr.html',1,'cv::cudev']]], - ['sobelyptr_1282',['sobelYPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e67a64ceb921f54607d12ee7dcdb57',1,'cv::cudev::sobelYPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e67a64ceb921f54607d12ee7dcdb57',1,'sobelYPtr()(Global Namespace)']]], - ['sobelyptrsz_1283',['SobelYPtrSz',['https://docs.opencv.org/4.2.0/dd/dc6/structcv_1_1cudev_1_1SobelYPtrSz.html',1,'cv::cudev']]], - ['soft_5fmargin_1284',['SOFT_MARGIN',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a9b5c495b5593ffda8a7055da07d0b751a8d6a7f40e040703bb29dd3896b86cc9c',1,'cv::ml::SVMSGD']]], - ['softdouble_1285',['softdouble',['https://docs.opencv.org/4.2.0/de/df1/structcv_1_1softdouble.html',1,'cv::softdouble'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaeeadf92dca0d8472616f8608fdcb241e',1,'cv::softdouble::softdouble()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c2434a765a38cafc214c81b54239742',1,'cv::softdouble::softdouble(const softdouble &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga136cdc02508643e0c523b83fe4abd6ca',1,'cv::softdouble::softdouble(const uint32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad6c2c15092e4652a37c32ae066b498aa',1,'cv::softdouble::softdouble(const uint64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga91be418b1b6f40094a8212c5997e680a',1,'cv::softdouble::softdouble(const int32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad2ef086e5378199006e95bab0913cbaf',1,'cv::softdouble::softdouble(const int64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab0ba4201e29886459956de5500d51672',1,'cv::softdouble::softdouble(const double a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaeeadf92dca0d8472616f8608fdcb241e',1,'softdouble()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c2434a765a38cafc214c81b54239742',1,'softdouble(const softdouble &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga136cdc02508643e0c523b83fe4abd6ca',1,'softdouble(const uint32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad6c2c15092e4652a37c32ae066b498aa',1,'softdouble(const uint64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga91be418b1b6f40094a8212c5997e680a',1,'softdouble(const int32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad2ef086e5378199006e95bab0913cbaf',1,'softdouble(const int64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab0ba4201e29886459956de5500d51672',1,'softdouble(const double a)(Global Namespace)']]], - ['softfloat_1286',['softfloat',['https://docs.opencv.org/4.2.0/d7/d2f/structcv_1_1softfloat.html',1,'cv::softfloat'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3bff550288d8719474fe71f463fbfc7f',1,'cv::softfloat::softfloat()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga1a4225942d70d185f9e046d6c863df31',1,'cv::softfloat::softfloat(const softfloat &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga79cdf60b97caf7ba8093f24b8fbbf92c',1,'cv::softfloat::softfloat(const uint32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga16fc78346e0adfbe62a1e6e61939289c',1,'cv::softfloat::softfloat(const uint64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadc3eed39f933f4924ac16a0be93df54c',1,'cv::softfloat::softfloat(const int32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga66426ab441c67a01df01529ccc46521c',1,'cv::softfloat::softfloat(const int64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga04202c2edb5f1f8f75e806fb37abc3b9',1,'cv::softfloat::softfloat(const float a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3bff550288d8719474fe71f463fbfc7f',1,'softfloat()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga1a4225942d70d185f9e046d6c863df31',1,'softfloat(const softfloat &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga79cdf60b97caf7ba8093f24b8fbbf92c',1,'softfloat(const uint32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga16fc78346e0adfbe62a1e6e61939289c',1,'softfloat(const uint64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadc3eed39f933f4924ac16a0be93df54c',1,'softfloat(const int32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga66426ab441c67a01df01529ccc46521c',1,'softfloat(const int64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga04202c2edb5f1f8f75e806fb37abc3b9',1,'softfloat(const float a)(Global Namespace)']]], - ['softfloat_20support_1287',['Softfloat support',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html',1,'']]], - ['softfloat_2ehpp_1288',['softfloat.hpp',['https://docs.opencv.org/4.2.0/db/d2e/softfloat_8hpp.html',1,'']]], - ['softmaxlayer_1289',['SoftmaxLayer',['https://docs.opencv.org/4.2.0/d8/d18/classcv_1_1dnn_1_1SoftmaxLayer.html',1,'cv::dnn']]], - ['solve_1290',['Solve',['https://eigen.tuxfamily.org/dox/classEigen_1_1Solve.html',1,'Eigen']]], - ['solve_1291',['solve',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'cv::Matx::solve(const Matx< _Tp, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'cv::Matx::solve(const Vec< _Tp, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< _Tp, cn, 1 >::solve(const Matx< _Tp, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< _Tp, cn, 1 >::solve(const Vec< _Tp, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 1, 3 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 1, 3 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 2, 2 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 2, 2 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 2, 3 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 2, 3 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 3, 3 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 3, 3 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 3, 4 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 3, 4 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 4, 4 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 4, 4 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, cn, 1 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, cn, 1 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float, 2, 3 >::solve(const Matx< float, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float, 2, 3 >::solve(const Vec< float, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float, 3, 3 >::solve(const Matx< float, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float, 3, 3 >::solve(const Vec< float, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float, cn, 1 >::solve(const Matx< float, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float, cn, 1 >::solve(const Vec< float, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float_type, 4, 4 >::solve(const Matx< float_type, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float_type, 4, 4 >::solve(const Vec< float_type, m > &rhs, int method) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aaa9c4af89930ab3bb7612ed9ae33d3f5',1,'Eigen::ColPivHouseholderQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aaa9c4af89930ab3bb7612ed9ae33d3f5',1,'ColPivHouseholderQR< MatrixType >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ab303e177cc7df17e435c79dca9ef5654',1,'Eigen::CompleteOrthogonalDecomposition::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a6f1b0a116c78e642e3d2a100a29d1a4a',1,'Eigen::FullPivHouseholderQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#af563471f6f3283fd10779ef02dd0b748',1,'Eigen::FullPivLU::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#a3e8e56769bbaaed0616ad98c4ff99c7b',1,'Eigen::HouseholderQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#aa257dd7a8acf8b347d5a22a13d6ca3e1',1,'Eigen::LDLT::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a3738bb3ce6f9b837a2beb432b937499f',1,'Eigen::LLT::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a49247bd2f742a46bca1f9c2bf1b19ad8',1,'Eigen::PartialPivLU::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'Eigen::SolverBase::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< FullPivLU< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< HouseholderQR< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< LLT< _MatrixType, _UpLo > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< PartialPivLU< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< SVDBase< Derived > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a1a0c8d5e08202f159553ceb01afb07d6',1,'Eigen::SparseLU::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a2892802e7cc880357af770ee02515859',1,'Eigen::SparseQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'Eigen::SparseSolverBase::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'Eigen::SparseSolverBase::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< IncompleteLUT< _Scalar, int > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< IncompleteLUT< _Scalar, int > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< KLU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< KLU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< SuperILU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< SuperILU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< SuperLU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< SuperLU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< UmfPackLU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< UmfPackLU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#ab28499936c0764fe5b56b9f4de701e26',1,'Eigen::SVDBase::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#ab28499936c0764fe5b56b9f4de701e26',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a911664ccf5522c778ffc5405247e8a59',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::solve()'],['../classkinematics_1_1ArmKinematics.html#a34487a1615ea239fba599f86bc3df913',1,'kinematics::ArmKinematics::solve()'],['../classkinematics_1_1InverseArmKinematics.html#a566ec29651bdf0b09fcd5b4bfe2e7d29',1,'kinematics::InverseArmKinematics::solve()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga12b43690dbd31fed96f213eefead2373',1,'cv::solve()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga12b43690dbd31fed96f213eefead2373',1,'solve()(Global Namespace)']]], - ['solvecubic_1292',['solveCubic',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1c3b0b925b085b6e96931ee309e6a1da',1,'cv::solveCubic()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1c3b0b925b085b6e96931ee309e6a1da',1,'solveCubic()(Global Namespace)']]], - ['solveinplace_1293',['solveInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a43bae99c287250d6092c8f8d1ba90e91',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::solveInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01MatrixType_00_01Mode_00_01Sparse_01_4.html#a3f3385e827fcc0bf27d1ec21c80740bc',1,'Eigen::TriangularViewImpl< MatrixType, Mode, Sparse >::solveInPlace(MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01MatrixType_00_01Mode_00_01Sparse_01_4.html#a70190d4105e1fd4f27abbf73365dfa0c',1,'Eigen::TriangularViewImpl< MatrixType, Mode, Sparse >::solveInPlace(SparseMatrixBase< OtherDerived > &other) const']]], - ['solvelp_1294',['solveLP',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#ga9a06d237a9d38ace891efa1ca1b5d00a',1,'cv::solveLP()'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#ga9a06d237a9d38ace891efa1ca1b5d00a',1,'solveLP()(Global Namespace)']]], - ['solvelp_5fmulti_1295',['SOLVELP_MULTI',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14ca94f9f0f66b795a4df9861e236064f1f0',1,'cv::SOLVELP_MULTI'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14ca94f9f0f66b795a4df9861e236064f1f0',1,'SOLVELP_MULTI(Global Namespace)']]], - ['solvelp_5fsingle_1296',['SOLVELP_SINGLE',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14ca4f5a045a7b15b7b64acee6107b76e7b5',1,'cv::SOLVELP_SINGLE'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14ca4f5a045a7b15b7b64acee6107b76e7b5',1,'SOLVELP_SINGLE(Global Namespace)']]], - ['solvelp_5funbounded_1297',['SOLVELP_UNBOUNDED',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14ca53443e5084b8afbd368920564a005e6b',1,'cv::SOLVELP_UNBOUNDED'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14ca53443e5084b8afbd368920564a005e6b',1,'SOLVELP_UNBOUNDED(Global Namespace)']]], - ['solvelp_5funfeasible_1298',['SOLVELP_UNFEASIBLE',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14cae1450427844e557ad644cb4fcd44edef',1,'cv::SOLVELP_UNFEASIBLE'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14cae1450427844e557ad644cb4fcd44edef',1,'SOLVELP_UNFEASIBLE(Global Namespace)']]], - ['solvelpresult_1299',['SolveLPResult',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#ga86a370deffb37af51deb405a634eb14c',1,'cv::SolveLPResult'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#ga86a370deffb37af51deb405a634eb14c',1,'SolveLPResult(Global Namespace)']]], - ['solvep3p_1300',['solveP3P',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gae5af86788e99948d40b39a03f6acf623',1,'cv::solveP3P()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gae5af86788e99948d40b39a03f6acf623',1,'solveP3P()(Global Namespace)']]], - ['solvepnp_1301',['solvePnP',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga549c2075fac14829ff4a58bc931c033d',1,'cv::solvePnP()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga549c2075fac14829ff4a58bc931c033d',1,'solvePnP()(Global Namespace)']]], - ['solvepnp_5fap3p_1302',['SOLVEPNP_AP3P',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869a8d48dece2da6492d91fa2de0a04679f9',1,'cv::SOLVEPNP_AP3P'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869a8d48dece2da6492d91fa2de0a04679f9',1,'SOLVEPNP_AP3P(Global Namespace)']]], - ['solvepnp_5fdls_1303',['SOLVEPNP_DLS',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869aa51f13248282b8778003b9a4cf8ac07e',1,'cv::SOLVEPNP_DLS'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869aa51f13248282b8778003b9a4cf8ac07e',1,'SOLVEPNP_DLS(Global Namespace)']]], - ['solvepnp_5fepnp_1304',['SOLVEPNP_EPNP',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869ae25763f5155defc67ef0f68b74d6c074',1,'cv::SOLVEPNP_EPNP'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869ae25763f5155defc67ef0f68b74d6c074',1,'SOLVEPNP_EPNP(Global Namespace)']]], - ['solvepnp_5fippe_1305',['SOLVEPNP_IPPE',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869acbd7d9f9513a22a59412661a9d31ca3d',1,'cv::SOLVEPNP_IPPE'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869acbd7d9f9513a22a59412661a9d31ca3d',1,'SOLVEPNP_IPPE(Global Namespace)']]], - ['solvepnp_5fippe_5fsquare_1306',['SOLVEPNP_IPPE_SQUARE',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869ac5d28b2805d3ac32fd477eee4479406f',1,'cv::SOLVEPNP_IPPE_SQUARE'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869ac5d28b2805d3ac32fd477eee4479406f',1,'SOLVEPNP_IPPE_SQUARE(Global Namespace)']]], - ['solvepnp_5fiterative_1307',['SOLVEPNP_ITERATIVE',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869a9f589872a7f7d687dc58294e01ea33a5',1,'cv::SOLVEPNP_ITERATIVE'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869a9f589872a7f7d687dc58294e01ea33a5',1,'SOLVEPNP_ITERATIVE(Global Namespace)']]], - ['solvepnp_5fp3p_1308',['SOLVEPNP_P3P',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869af33a85ca698777ff9bd1de916bf5959a',1,'cv::SOLVEPNP_P3P'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869af33a85ca698777ff9bd1de916bf5959a',1,'SOLVEPNP_P3P(Global Namespace)']]], - ['solvepnp_5fupnp_1309',['SOLVEPNP_UPNP',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869a2859c9ce1430662096d3cc3b5462847f',1,'cv::SOLVEPNP_UPNP'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869a2859c9ce1430662096d3cc3b5462847f',1,'SOLVEPNP_UPNP(Global Namespace)']]], - ['solvepnpgeneric_1310',['solvePnPGeneric',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga624af8a6641b9bdb487f63f694e8bb90',1,'cv::solvePnPGeneric()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga624af8a6641b9bdb487f63f694e8bb90',1,'solvePnPGeneric()(Global Namespace)']]], - ['solvepnpmethod_1311',['SolvePnPMethod',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga357634492a94efe8858d0ce1509da869',1,'cv::SolvePnPMethod'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga357634492a94efe8858d0ce1509da869',1,'SolvePnPMethod(Global Namespace)']]], - ['solvepnpransac_1312',['solvePnPRansac',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga50620f0e26e02caa2e9adc07b5fbf24e',1,'cv::solvePnPRansac()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga585fcff4132c58f83132e72df5bab179',1,'cv::cuda::solvePnPRansac()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga50620f0e26e02caa2e9adc07b5fbf24e',1,'solvePnPRansac(InputArray objectPoints, InputArray imagePoints, InputArray cameraMatrix, InputArray distCoeffs, OutputArray rvec, OutputArray tvec, bool useExtrinsicGuess=false, int iterationsCount=100, float reprojectionError=8.0, double confidence=0.99, OutputArray inliers=noArray(), int flags=SOLVEPNP_ITERATIVE)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga585fcff4132c58f83132e72df5bab179',1,'solvePnPRansac(const Mat &object, const Mat &image, const Mat &camera_mat, const Mat &dist_coef, Mat &rvec, Mat &tvec, bool use_extrinsic_guess=false, int num_iters=100, float max_dist=8.0, int min_inlier_count=100, std::vector< int > *inliers=NULL)(Global Namespace)']]], - ['solvepnprefinelm_1313',['solvePnPRefineLM',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga650ba4d286a96d992f82c3e6dfa525fa',1,'cv::solvePnPRefineLM()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga650ba4d286a96d992f82c3e6dfa525fa',1,'solvePnPRefineLM()(Global Namespace)']]], - ['solvepnprefinevvs_1314',['solvePnPRefineVVS',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga17491c0282e4af874f6206a9166774a5',1,'cv::solvePnPRefineVVS()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga17491c0282e4af874f6206a9166774a5',1,'solvePnPRefineVVS()(Global Namespace)']]], - ['solvepoly_1315',['solvePoly',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gac2f5e953016fabcdf793d762f4ec5dce',1,'cv::solvePoly()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gac2f5e953016fabcdf793d762f4ec5dce',1,'solvePoly()(Global Namespace)']]], - ['solverbase_1316',['SolverBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'Eigen::SolverBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'Eigen::SolverBase::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< FullPivLU< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< HouseholderQR< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< LLT< _MatrixType, _UpLo > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< PartialPivLU< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< SVDBase< Derived > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::SolverBase()']]], - ['solverbase_3c_20colpivhouseholderqr_3c_20_5fmatrixtype_20_3e_20_3e_1317',['SolverBase< ColPivHouseholderQR< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], - ['solverbase_3c_20colpivhouseholderqr_3c_20matrixtype_20_3e_20_3e_1318',['SolverBase< ColPivHouseholderQR< MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], - ['solverbase_3c_20completeorthogonaldecomposition_3c_20_5fmatrixtype_20_3e_20_3e_1319',['SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], - ['solverbase_3c_20fullpivhouseholderqr_3c_20_5fmatrixtype_20_3e_20_3e_1320',['SolverBase< FullPivHouseholderQR< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], - ['solverbase_3c_20fullpivlu_3c_20_5fmatrixtype_20_3e_20_3e_1321',['SolverBase< FullPivLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], - ['solverbase_3c_20householderqr_3c_20_5fmatrixtype_20_3e_20_3e_1322',['SolverBase< HouseholderQR< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], - ['solverbase_3c_20ldlt_3c_20_5fmatrixtype_2c_20_5fuplo_20_3e_20_3e_1323',['SolverBase< LDLT< _MatrixType, _UpLo > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], - ['solverbase_3c_20llt_3c_20_5fmatrixtype_2c_20_5fuplo_20_3e_20_3e_1324',['SolverBase< LLT< _MatrixType, _UpLo > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], - ['solverbase_3c_20partialpivlu_3c_20_5fmatrixtype_20_3e_20_3e_1325',['SolverBase< PartialPivLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], - ['solverbase_3c_20svdbase_3c_20derived_20_3e_20_3e_1326',['SolverBase< SVDBase< Derived > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], - ['solverbase_3c_20svdbase_3c_20jacobisvd_3c_20_5fmatrixtype_2c_20qrpreconditioner_20_3e_20_3e_20_3e_1327',['SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], - ['solvers_1328',['Matrix-free solvers',['https://eigen.tuxfamily.org/dox/group__MatrixfreeSolverExample.html',1,'']]], - ['solverstorage_1329',['SolverStorage',['https://eigen.tuxfamily.org/dox/structEigen_1_1SolverStorage.html',1,'Eigen']]], - ['solvertype_1330',['solverType',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a03f2326fd7c314d6ed1ff841fcdc7dc1',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['solvertype_1331',['SolverType',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gaac4a33e26da30a5c5aa1ed3f66fc0998',1,'cv::optflow::SolverType'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gaac4a33e26da30a5c5aa1ed3f66fc0998',1,'SolverType(Global Namespace)']]], - ['solvewithguess_1332',['SolveWithGuess',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolveWithGuess.html',1,'Eigen']]], - ['solvewithguess_1333',['solveWithGuess',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#adcc18d1ab283786dcbb5a3f63f4b4bd8',1,'Eigen::IterativeSolverBase']]], - ['solvez_1334',['solveZ',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#ab255cd24a882ab993fb2f7377ef2774a',1,'cv::SVD']]], - ['solving_20linear_20least_20squares_20systems_1335',['Solving linear least squares systems',['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'']]], - ['solving_20sparse_20linear_20systems_1336',['Solving Sparse Linear Systems',['https://eigen.tuxfamily.org/dox/group__TopicSparseSystems.html',1,'']]], - ['some_20data_20structures_1337',['Some Data Structures',['https://docs.opencv.org/4.2.0/d5/df1/tutorial_js_some_data_structures.html',1,'']]], - ['sort_1338',['sort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a150b5b104440ea65709e70a7f2eba06b',1,'list< __inp, __rebind_inp >::sort()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a96029060c6dd54dc811b3c0d59b06537',1,'list< __inp, __rebind_inp >::sort(_StrictWeakOrdering)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a4bb37711f3350692a1246d7781967ea6',1,'std::forward_list::sort()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a3f59eaf1f58f480eafa906d68d408682',1,'std::forward_list::sort(_Comp __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a150b5b104440ea65709e70a7f2eba06b',1,'std::list::sort()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a96029060c6dd54dc811b3c0d59b06537',1,'std::list::sort(_StrictWeakOrdering)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga45dd56da289494ce874be2324856898f',1,'cv::sort()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga45dd56da289494ce874be2324856898f',1,'sort()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga4ea03048647c50ea7cbdd5da30e82755',1,'std::sort(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gae3c0067ae83db1824367ded659a960b2',1,'std::sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga4ea03048647c50ea7cbdd5da30e82755',1,'sort(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gae3c0067ae83db1824367ded659a960b2',1,'sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['sort_2eh_1339',['sort.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00971.html',1,'']]], - ['sort_5fascending_1340',['SORT_ASCENDING',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667ba62b054bb27aeefd25fb6728034b630a2',1,'cv::SORT_ASCENDING'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667ba62b054bb27aeefd25fb6728034b630a2',1,'SORT_ASCENDING(Global Namespace)']]], - ['sort_5fdescending_1341',['SORT_DESCENDING',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667bac23176acbd1cbe51058088d1358367dc',1,'cv::SORT_DESCENDING'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667bac23176acbd1cbe51058088d1358367dc',1,'SORT_DESCENDING(Global Namespace)']]], - ['sort_5fevery_5fcolumn_1342',['SORT_EVERY_COLUMN',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667ba5be81ea78c4ed2dc7aca349d5dabec36',1,'cv::SORT_EVERY_COLUMN'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667ba5be81ea78c4ed2dc7aca349d5dabec36',1,'SORT_EVERY_COLUMN(Global Namespace)']]], - ['sort_5fevery_5frow_1343',['SORT_EVERY_ROW',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667ba9776827c6c057260be34311392e6b618',1,'cv::SORT_EVERY_ROW'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667ba9776827c6c057260be34311392e6b618',1,'SORT_EVERY_ROW(Global Namespace)']]], - ['sort_5fheap_1344',['sort_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga7e302d6652402edae355b8726b2b7e27',1,'std::sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga441060fda917c1aed4e8fab9c860f706',1,'std::sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga7e302d6652402edae355b8726b2b7e27',1,'sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga441060fda917c1aed4e8fab9c860f706',1,'sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['sort_5fminimal_5fn_1345',['sort_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a16e8a6461d487c29d0657c8f48575616',1,'__gnu_parallel::_Settings']]], - ['sort_5fmwms_5foversampling_1346',['sort_mwms_oversampling',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a0f435bbb73735fb8fdec296eed3c5996',1,'__gnu_parallel::_Settings']]], - ['sort_5fqs_5fnum_5fsamples_5fpreset_1347',['sort_qs_num_samples_preset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a5d52b268aa07e731f6b01ff2fdd49904',1,'__gnu_parallel::_Settings']]], - ['sort_5fqsb_5fbase_5fcase_5fmaximal_5fn_1348',['sort_qsb_base_case_maximal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a3a0bbce1f017d9a3ea2ea176722ed853',1,'__gnu_parallel::_Settings']]], - ['sortflags_1349',['SortFlags',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga8e88a1f27e41e12f81caab17cf81667b',1,'cv::SortFlags'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga8e88a1f27e41e12f81caab17cf81667b',1,'SortFlags(Global Namespace)']]], - ['sortidx_1350',['sortIdx',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadf35157cbf97f3cb85a545380e383506',1,'cv::sortIdx()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadf35157cbf97f3cb85a545380e383506',1,'sortIdx(InputArray src, OutputArray dst, int flags)(Global Namespace)']]], - ['sorting_1351',['Sorting',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html',1,'']]], - ['source_1352',['source',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#aa5ae8887e0dc06f966ba83aaf4102666',1,'cv::ocl::Program::source()'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a456b1a9829e6474696410160b180293a',1,'cv::ocl::ProgramSource::source()']]], - ['source_2ehpp_1353',['source.hpp',['https://docs.opencv.org/4.2.0/d2/d2e/source_8hpp.html',1,'']]], - ['space_20conversions_1354',['Color Space Conversions',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html',1,'']]], - ['space_20processing_1355',['Color space processing',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html',1,'']]], - ['space_20to_20another_1356',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], - ['space_20transformations_1357',['Space transformations',['https://eigen.tuxfamily.org/dox/group__TutorialGeometry.html',1,'']]], - ['spaces_1358',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], - ['sparse_1359',['Sparse',['https://eigen.tuxfamily.org/dox/structEigen_1_1Sparse.html',1,'Eigen']]], - ['sparse_20linear_20algebra_1360',['Sparse linear algebra',['https://eigen.tuxfamily.org/dox/group__Sparse__chapter.html',1,'']]], - ['sparse_20linear_20systems_1361',['Solving Sparse Linear Systems',['https://eigen.tuxfamily.org/dox/group__TopicSparseSystems.html',1,'']]], - ['sparse_20matrices_1362',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], - ['sparse_20matrix_20manipulations_1363',['Sparse matrix manipulations',['https://eigen.tuxfamily.org/dox/group__TutorialSparse.html',1,'']]], - ['sparse_20meta_20module_1364',['Sparse meta-module',['https://eigen.tuxfamily.org/dox/group__Sparse__Module.html',1,'']]], - ['sparse_5fmatch_5finterpolator_2ehpp_1365',['sparse_match_interpolator.hpp',['https://docs.opencv.org/4.2.0/d6/dcd/sparse__match__interpolator_8hpp.html',1,'']]], - ['sparse_5fmatching_5fgpc_2ehpp_1366',['sparse_matching_gpc.hpp',['https://docs.opencv.org/4.2.0/d8/dc5/sparse__matching__gpc_8hpp.html',1,'']]], - ['sparsecholesky_20module_1367',['SparseCholesky module',['https://eigen.tuxfamily.org/dox/group__SparseCholesky__Module.html',1,'']]], - ['sparsecompressedbase_1368',['SparseCompressedBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'Eigen::SparseCompressedBase'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'Eigen::SparseCompressedBase::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Derived >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Transpose< MatrixType > >::SparseCompressedBase()']]], - ['sparsecompressedbase_3c_20block_3c_20const_20sparsematrix_3c_20_5fscalar_2c_20_5foptions_2c_20_5fstorageindex_20_3e_2c_20blockrows_2c_20blockcols_2c_20true_20_3e_20_3e_1369',['SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], - ['sparsecompressedbase_3c_20block_3c_20sparsematrix_3c_20_5fscalar_2c_20_5foptions_2c_20_5fstorageindex_20_3e_2c_20blockrows_2c_20blockcols_2c_20true_20_3e_20_3e_1370',['SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], - ['sparsecompressedbase_3c_20block_3c_20sparsematrixtype_2c_20blockrows_2c_20blockcols_2c_20true_20_3e_20_3e_1371',['SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], - ['sparsecompressedbase_3c_20derived_20_3e_1372',['SparseCompressedBase< Derived >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], - ['sparsecompressedbase_3c_20sparsematrix_3c_20_5fscalar_2c_20_5foptions_2c_20_5fstorageindex_20_3e_20_3e_1373',['SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], - ['sparsecompressedbase_3c_20sparsematrix_3c_20scalar_2c_20_5foptions_2c_20_5fstorageindex_20_3e_20_3e_1374',['SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], - ['sparsecompressedbase_3c_20sparsematrix_3c_20scalar_2c_20_5foptions_2c_20int_20_3e_20_3e_1375',['SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], - ['sparsecompressedbase_3c_20sparsematrix_3c_20scalar_2c_20_5foptions_2c_20storageindex_20_3e_20_3e_1376',['SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], - ['sparsecompressedbase_3c_20transpose_3c_20matrixtype_20_3e_20_3e_1377',['SparseCompressedBase< Transpose< MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], - ['sparsecore_20module_1378',['SparseCore module',['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html',1,'']]], - ['sparselu_1379',['SparseLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html',1,'Eigen']]], - ['sparselu_20module_1380',['SparseLU module',['https://eigen.tuxfamily.org/dox/group__SparseLU__Module.html',1,'']]], - ['sparsemapbase_3c_20derived_2c_20readonlyaccessors_20_3e_1381',['SparseMapBase< Derived, ReadOnlyAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html',1,'Eigen']]], - ['sparsemapbase_3c_20derived_2c_20writeaccessors_20_3e_1382',['SparseMapBase< Derived, WriteAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html',1,'Eigen']]], - ['sparsemat_1383',['SparseMat',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html',1,'cv::SparseMat'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a9b5f1214a43144122b158c354a93e338',1,'cv::SparseMat::SparseMat()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a62224fe4fbdc6134d80861a150e01b58',1,'cv::SparseMat::SparseMat(int dims, const int *_sizes, int _type)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a753add6192d4355c04e6e3594ab97b49',1,'cv::SparseMat::SparseMat(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af9432a94bda00c7fd2103bcd57654d03',1,'cv::SparseMat::SparseMat(const Mat &m)']]], - ['sparsemat_5f_1384',['SparseMat_',['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html',1,'cv::SparseMat_< _Tp >'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a359e83f7b4372d439ad31a84e72cd12d',1,'cv::SparseMat_::SparseMat_()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#adb611458d46e670dcaf099f1fceddf9c',1,'cv::SparseMat_::SparseMat_(int dims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ab0e9b029a622c637e17f8288d968f25c',1,'cv::SparseMat_::SparseMat_(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a773ae7065a51b5440d0d9c8b87b7eba3',1,'cv::SparseMat_::SparseMat_(const SparseMat_ &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a0938540b46ceeca038f396f019b1e3c4',1,'cv::SparseMat_::SparseMat_(const Mat &m)']]], - ['sparsematchinterpolator_1385',['SparseMatchInterpolator',['https://docs.opencv.org/4.2.0/d4/da8/classcv_1_1ximgproc_1_1SparseMatchInterpolator.html',1,'cv::ximgproc']]], - ['sparsematconstiterator_1386',['SparseMatConstIterator',['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html',1,'cv::SparseMatConstIterator'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#af3502cb42a852646d4f8cfed6e3b3c6b',1,'cv::SparseMatConstIterator::SparseMatConstIterator()'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a74e586f5019f8993d34da6dd9eaa74e8',1,'cv::SparseMatConstIterator::SparseMatConstIterator(const SparseMat *_m)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a7549ff275790855409b1da3b14a85ddd',1,'cv::SparseMatConstIterator::SparseMatConstIterator(const SparseMatConstIterator &it)']]], - ['sparsematconstiterator_5f_1387',['SparseMatConstIterator_',['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html',1,'cv::SparseMatConstIterator_< class >'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#ae840ff1fdc9aa20eac7953703f42a8ef',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#ac318c1458cb5078b03db72db21ac6de5',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_(const SparseMat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#addc0f436bbbf166ce0ff8a5455ff5009',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_(const SparseMat *_m)'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a5cfedc1a27fb81a75dbd8df905ec83b5',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_(const SparseMatConstIterator_ &it)']]], - ['sparsematiterator_1388',['SparseMatIterator',['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html',1,'cv::SparseMatIterator'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a40c1749ef7155fed17b82e2eb233c1d4',1,'cv::SparseMatIterator::SparseMatIterator()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a57bc97f37b1504118bee50c38b2fca2a',1,'cv::SparseMatIterator::SparseMatIterator(SparseMat *_m)'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a302209fba84cdd382c3c0ae7b6e3a064',1,'cv::SparseMatIterator::SparseMatIterator(SparseMat *_m, const int *idx)'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a567658fd3bf0d621f8249b3ddf6140f4',1,'cv::SparseMatIterator::SparseMatIterator(const SparseMatIterator &it)']]], - ['sparsematiterator_5f_1389',['SparseMatIterator_',['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html',1,'cv::SparseMatIterator_< class >'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a404a0443b24c1139f2c2b914cc468180',1,'cv::SparseMatIterator_::SparseMatIterator_()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#aa07345c1dc666f06d49018130a48aaee',1,'cv::SparseMatIterator_::SparseMatIterator_(SparseMat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a1c965fbfa854ab5bcb0e56ca051fb6c4',1,'cv::SparseMatIterator_::SparseMatIterator_(SparseMat *_m)'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a6d4b4fd6b4f061e0d95f1927130b15d4',1,'cv::SparseMatIterator_::SparseMatIterator_(const SparseMatIterator_ &it)']]], - ['sparsematrix_1390',['SparseMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html',1,'Eigen::SparseMatrix< class, _Options, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'Eigen::SparseMatrix::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'Eigen::SparseMatrix::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'Eigen::SparseMatrix::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'Eigen::SparseMatrix::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'Eigen::SparseMatrix::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'Eigen::SparseMatrix::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'Eigen::SparseMatrix::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar >::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(Index rows, Index cols)']]], - ['sparsematrix_3c_20scalar_20_3e_1391',['SparseMatrix< Scalar >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html',1,'']]], - ['sparsematrix_3c_20scalar_2c_20colmajor_2c_20int_20_3e_1392',['SparseMatrix< Scalar, ColMajor, int >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html',1,'']]], - ['sparsematrix_3c_20scalar_2c_20colmajor_2c_20storageindex_20_3e_1393',['SparseMatrix< Scalar, ColMajor, StorageIndex >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html',1,'']]], - ['sparsematrix_3c_20scalar_2c_20rowmajor_2c_20storageindex_20_3e_1394',['SparseMatrix< Scalar, RowMajor, StorageIndex >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html',1,'']]], - ['sparsematrixbase_1395',['SparseMatrixBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html',1,'Eigen']]], - ['sparsematrixbase_3c_20block_3c_20xprtype_2c_20blockrows_2c_20blockcols_2c_20innerpanel_20_3e_20_3e_1396',['SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html',1,'']]], - ['sparsematrixbase_3c_20block_3c_20xprtype_2c_20blockrows_2c_20blockcols_2c_20true_20_3e_20_3e_1397',['SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html',1,'']]], - ['sparsematrixbase_3c_20cwisebinaryop_3c_20binaryop_2c_20lhs_2c_20rhs_20_3e_20_3e_1398',['SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html',1,'']]], - ['sparsematrixbase_3c_20transpose_3c_20matrixtype_20_3e_20_3e_1399',['SparseMatrixBase< Transpose< MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html',1,'']]], - ['sparsematrixbase_3c_20triangularview_3c_20matrixtype_2c_20mode_20_3e_20_3e_1400',['SparseMatrixBase< TriangularView< MatrixType, Mode > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html',1,'']]], - ['sparseopticalflow_1401',['SparseOpticalFlow',['https://docs.opencv.org/4.2.0/d5/dcf/classcv_1_1cuda_1_1SparseOpticalFlow.html',1,'cv::cuda::SparseOpticalFlow'],['https://docs.opencv.org/4.2.0/de/d14/classcv_1_1SparseOpticalFlow.html',1,'cv::SparseOpticalFlow']]], - ['sparsepyrlkoptflowestimator_1402',['SparsePyrLkOptFlowEstimator',['https://docs.opencv.org/4.2.0/d1/d4b/classcv_1_1videostab_1_1SparsePyrLkOptFlowEstimator.html',1,'cv::videostab']]], - ['sparsepyrlkopticalflow_1403',['SparsePyrLKOpticalFlow',['https://docs.opencv.org/4.2.0/d7/d05/classcv_1_1cuda_1_1SparsePyrLKOpticalFlow.html',1,'cv::cuda::SparsePyrLKOpticalFlow'],['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html',1,'cv::SparsePyrLKOpticalFlow']]], - ['sparseqr_1404',['SparseQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html',1,'Eigen::SparseQR'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a33f76a247183dc50c9c1cbf151288839',1,'Eigen::SparseQR::SparseQR()']]], - ['sparseqr_20module_1405',['SparseQR module',['https://eigen.tuxfamily.org/dox/group__SparseQR__Module.html',1,'']]], - ['sparserate_1406',['sparseRate',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#a65605ddda7dd90c5bc3201585e276e16',1,'cv::optflow::OpticalFlowPCAFlow']]], - ['sparserlofopticalflow_1407',['SparseRLOFOpticalFlow',['https://docs.opencv.org/4.2.0/df/dc4/classcv_1_1optflow_1_1SparseRLOFOpticalFlow.html',1,'cv::optflow']]], - ['sparseselfadjointview_1408',['SparseSelfAdjointView',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html',1,'Eigen']]], - ['sparseselfadjointview_3c_20const_20derived_2c_20uplo_20_3e_1409',['SparseSelfAdjointView< const Derived, UpLo >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html',1,'']]], - ['sparsesolverbase_1410',['SparseSolverBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'Eigen::SparseSolverBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'Eigen::SparseSolverBase::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< IncompleteLUT< _Scalar, int > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< KLU< _MatrixType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< SuperILU< _MatrixType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< SuperLU< _MatrixType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< UmfPackLU< _MatrixType > >::SparseSolverBase()']]], - ['sparsesolverbase_3c_20cholmoddecomposition_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_1411',['SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], - ['sparsesolverbase_3c_20cholmodsimplicialldlt_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_1412',['SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], - ['sparsesolverbase_3c_20cholmodsimplicialllt_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_1413',['SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], - ['sparsesolverbase_3c_20cholmodsupernodalllt_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_1414',['SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], - ['sparsesolverbase_3c_20incompletecholesky_3c_20scalar_2c_20lower_2c_20amdordering_3c_20int_20_3e_20_3e_20_3e_1415',['SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], - ['sparsesolverbase_3c_20incompletelut_3c_20_5fscalar_2c_20int_20_3e_20_3e_1416',['SparseSolverBase< IncompleteLUT< _Scalar, int > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], - ['sparsesolverbase_3c_20klu_3c_20_5fmatrixtype_20_3e_20_3e_1417',['SparseSolverBase< KLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], - ['sparsesolverbase_3c_20sparselutransposeview_3c_20conjugate_2c_20sparselutype_20_3e_20_3e_1418',['SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], - ['sparsesolverbase_3c_20superilu_3c_20_5fmatrixtype_20_3e_20_3e_1419',['SparseSolverBase< SuperILU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], - ['sparsesolverbase_3c_20superlu_3c_20_5fmatrixtype_20_3e_20_3e_1420',['SparseSolverBase< SuperLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], - ['sparsesolverbase_3c_20umfpacklu_3c_20_5fmatrixtype_20_3e_20_3e_1421',['SparseSolverBase< UmfPackLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], - ['sparsevector_1422',['SparseVector',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html',1,'Eigen']]], - ['sparseview_1423',['SparseView',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseView.html',1,'Eigen']]], - ['sparseview_1424',['sparseView',['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'Eigen::MatrixBase::sparseView()'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sparseView()'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'MatrixBase< Solve< Decomposition, RhsType > >::sparseView()'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'sparseView()(Global Namespace)']]], - ['spatialgradient_1425',['spatialGradient',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga405d03b20c782b65a4daf54d233239a2',1,'cv::spatialGradient()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga405d03b20c782b65a4daf54d233239a2',1,'spatialGradient()(Global Namespace)']]], - ['spatialscale_1426',['spatialScale',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#aa0eba7ed083df27e764c4d1a85004032',1,'cv::dnn::PoolingLayer']]], - ['specfun_2eh_1427',['specfun.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00515.html',1,'']]], - ['special_20functions_1428',['Special Functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html',1,'Mathematical Special Functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html',1,'Mathematical Special Functions']]], - ['specialfilter_1429',['SpecialFilter',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gad8e695e87dee497e227716576c244598',1,'cv::SpecialFilter'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gad8e695e87dee497e227716576c244598',1,'SpecialFilter(Global Namespace)']]], - ['specifytype_1430',['specifyType',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#a6541ff9f95d789c14807e990dcb55ee9',1,'cv::detail::GArrayU']]], - ['specklex_1431',['speckleX',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a860c2b18eb7ed0d728bb8f689391cf3b',1,'cv::stereo::Matching']]], - ['speckley_1432',['speckleY',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#ae0b6479e54384522a02f6714b83bcd0e',1,'cv::stereo::Matching']]], - ['speeded_20up_20robust_20features_1433',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], - ['sph_5fbessel_1434',['sph_bessel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga478e517ed975bcb256de230e64f0fda5',1,'std::sph_bessel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2bf44b5e5a3b33d518d8a49e06433ece',1,'std::tr1::sph_bessel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga478e517ed975bcb256de230e64f0fda5',1,'sph_bessel(unsigned int __n, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2bf44b5e5a3b33d518d8a49e06433ece',1,'sph_bessel(unsigned int __n, _Tp __x)(Global Namespace)']]], - ['sph_5fbesself_1435',['sph_besself',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga534e36e1dcefad8daec98920db16eec4',1,'std::sph_besself()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga534e36e1dcefad8daec98920db16eec4',1,'sph_besself()(Global Namespace)']]], - ['sph_5fbessell_1436',['sph_bessell',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga11d72b1af81ce9da3c878a25087ee927',1,'std::sph_bessell()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga11d72b1af81ce9da3c878a25087ee927',1,'sph_bessell()(Global Namespace)']]], - ['sph_5flegendre_1437',['sph_legendre',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga573842c12247b87746b548f1945755a8',1,'std::sph_legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga6281837b14f373c4b331509580f66b35',1,'std::tr1::sph_legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga573842c12247b87746b548f1945755a8',1,'sph_legendre(unsigned int __l, unsigned int __m, _Tp __theta)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga6281837b14f373c4b331509580f66b35',1,'sph_legendre(unsigned int __l, unsigned int __m, _Tp __theta)(Global Namespace)']]], - ['sph_5flegendref_1438',['sph_legendref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaae635d28c06a3be2679901b382090852',1,'std::sph_legendref()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaae635d28c06a3be2679901b382090852',1,'sph_legendref()(Global Namespace)']]], - ['sph_5flegendrel_1439',['sph_legendrel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga2f6618dea1847f09fd67f3c974c1910d',1,'std::sph_legendrel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga2f6618dea1847f09fd67f3c974c1910d',1,'sph_legendrel()(Global Namespace)']]], - ['sph_5fneumann_1440',['sph_neumann',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1cf4362a67ab5bae9e6b69c867e85371',1,'std::sph_neumann()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2d353e21ed716e078f26147fb603ed33',1,'std::tr1::sph_neumann()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1cf4362a67ab5bae9e6b69c867e85371',1,'sph_neumann(unsigned int __n, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2d353e21ed716e078f26147fb603ed33',1,'sph_neumann(unsigned int __n, _Tp __x)(Global Namespace)']]], - ['sph_5fneumannf_1441',['sph_neumannf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga789143122fa99536329bc2d1b1aac2f0',1,'std::sph_neumannf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga789143122fa99536329bc2d1b1aac2f0',1,'sph_neumannf()(Global Namespace)']]], - ['sph_5fneumannl_1442',['sph_neumannl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga3cededa9b6e4601f190c3811e6aabfd6',1,'std::sph_neumannl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga3cededa9b6e4601f190c3811e6aabfd6',1,'sph_neumannl()(Global Namespace)']]], - ['sphericalportraitprojector_1443',['SphericalPortraitProjector',['https://docs.opencv.org/4.2.0/d3/d0d/structcv_1_1detail_1_1SphericalPortraitProjector.html',1,'cv::detail']]], - ['sphericalportraitwarper_1444',['SphericalPortraitWarper',['https://docs.opencv.org/4.2.0/d8/d70/classcv_1_1detail_1_1SphericalPortraitWarper.html',1,'cv::detail::SphericalPortraitWarper'],['https://docs.opencv.org/4.2.0/d8/d70/classcv_1_1detail_1_1SphericalPortraitWarper.html#a28b73656940563a8b942778e0753d81f',1,'cv::detail::SphericalPortraitWarper::SphericalPortraitWarper()']]], - ['sphericalprojector_1445',['SphericalProjector',['https://docs.opencv.org/4.2.0/d0/d88/structcv_1_1detail_1_1SphericalProjector.html',1,'cv::detail']]], - ['sphericalwarper_1446',['SphericalWarper',['https://docs.opencv.org/4.2.0/d6/dd0/classcv_1_1detail_1_1SphericalWarper.html',1,'cv::detail::SphericalWarper'],['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1SphericalWarper.html',1,'cv::SphericalWarper'],['https://docs.opencv.org/4.2.0/d6/dd0/classcv_1_1detail_1_1SphericalWarper.html#a6d5126785c4821d61c3886523749b8ba',1,'cv::detail::SphericalWarper::SphericalWarper()']]], - ['sphericalwarpergpu_1447',['SphericalWarperGpu',['https://docs.opencv.org/4.2.0/db/d09/classcv_1_1detail_1_1SphericalWarperGpu.html',1,'cv::detail::SphericalWarperGpu'],['https://docs.opencv.org/4.2.0/db/d09/classcv_1_1detail_1_1SphericalWarperGpu.html#ad89e6054bd99e985c92a602c4e0c44ea',1,'cv::detail::SphericalWarperGpu::SphericalWarperGpu()']]], - ['spin_1448',['spin',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a26114066f4d49398fb1b98bde3b5dc78',1,'cv::viz::Viz3d']]], - ['spinonce_1449',['spinOnce',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a481d977ad11a63da44ece08e7f76fdef',1,'cv::viz::Viz3d']]], - ['splay_5ffn_5fimps_2ehpp_1450',['splay_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01427.html',1,'']]], - ['splay_5ftree_5f_2ehpp_1451',['splay_tree_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01430.html',1,'']]], - ['splay_5ftree_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_1452',['splay_tree_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16712.html',1,'']]], - ['splay_5ftree_5f_2fdebug_5ffn_5fimps_2ehpp_1453',['splay_tree_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16784.html',1,'']]], - ['splay_5ftree_5f_2ferase_5ffn_5fimps_2ehpp_1454',['splay_tree_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16847.html',1,'']]], - ['splay_5ftree_5f_2ffind_5ffn_5fimps_2ehpp_1455',['splay_tree_/find_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16892.html',1,'']]], - ['splay_5ftree_5f_2finfo_5ffn_5fimps_2ehpp_1456',['splay_tree_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16976.html',1,'']]], - ['splay_5ftree_5f_2finsert_5ffn_5fimps_2ehpp_1457',['splay_tree_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17012.html',1,'']]], - ['splay_5ftree_5f_2fnode_2ehpp_1458',['splay_tree_/node.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17105.html',1,'']]], - ['splay_5ftree_5f_2fsplit_5fjoin_5ffn_5fimps_2ehpp_1459',['splay_tree_/split_join_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17255.html',1,'']]], - ['splay_5ftree_5f_2ftraits_2ehpp_1460',['splay_tree_/traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17321.html',1,'']]], - ['splay_5ftree_5fmap_1461',['splay_tree_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12027.html',1,'__gnu_pbds::detail']]], - ['splay_5ftree_5fnode_5f_1462',['splay_tree_node_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12019.html',1,'__gnu_pbds::detail']]], - ['splay_5ftree_5ftag_1463',['splay_tree_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11247.html',1,'__gnu_pbds']]], - ['splice_1464',['splice',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a2fe50f31cf743a71040ad740b7d1609c',1,'cv::Subdiv2D::splice()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ae27f8110bc96c70775f1654e978b4c5f',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a11428bfeda40f933f26428bf432907db',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &&__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa9275ed20653d145bd3c324e0b0422c3',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa4a9d0e45f35bc5c51ee5b1646304bb6',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &&__x, const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a5e2e8e3c78743063a5223b09a7f7abf6',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &__x, const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ae27f8110bc96c70775f1654e978b4c5f',1,'std::list::splice(const_iterator __position, list &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a11428bfeda40f933f26428bf432907db',1,'std::list::splice(const_iterator __position, list &&__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa9275ed20653d145bd3c324e0b0422c3',1,'std::list::splice(const_iterator __position, list &__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa4a9d0e45f35bc5c51ee5b1646304bb6',1,'std::list::splice(const_iterator __position, list &&__x, const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a5e2e8e3c78743063a5223b09a7f7abf6',1,'std::list::splice(const_iterator __position, list &__x, const_iterator __first, const_iterator __last) noexcept']]], - ['splice_5fafter_1465',['splice_after',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a8918bd7e48f28df3b891edfc246556d0',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&__list) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aa3a2a989959206263a683014f575cdc3',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&__list, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a9c1efa0c819d46d9d19f7fc363e14307',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&, const_iterator __before, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac9ba3ce45ccc225252b0a7b14e883dcc',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &, const_iterator __before, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a9c1efa0c819d46d9d19f7fc363e14307',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&, const_iterator __before, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac9ba3ce45ccc225252b0a7b14e883dcc',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &, const_iterator __before, const_iterator __last) noexcept']]], - ['splines_5fmodule_1466',['Splines_Module',['https://eigen.tuxfamily.org/dox/group__Splines__Module.html',1,'']]], - ['split_1467',['Channel split',['https://docs.opencv.org/4.2.0/df/df2/group__core__hal__interface__split.html',1,'']]], - ['split_1468',['Split',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html',1,'cv::ml::DTrees::Split'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#aa25a57fa40ee868d39b50f4488cac462',1,'cv::ml::DTrees::Split::Split()']]], - ['split_1469',['split',['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#a39f10fb90b1ef7af76ee854c9214c5dc',1,'cv::ml::DTrees::Node::split'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0547c7fed86152d7e9d0096029c8518a',1,'cv::split(const Mat &src, Mat *mvbegin)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8027f9deee1e42716be8039e5863fbd9',1,'cv::split(InputArray m, OutputArrayOfArrays mv)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gabe5013d55d4ff586b20393913726179e',1,'cv::cuda::split(InputArray src, GpuMat *dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaf1714e7a9ea0719c29bf378beaf5f99d',1,'cv::cuda::split(InputArray src, std::vector< GpuMat > &dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html#gab5a8449f94bf741fb2b0a4f59ce1c81c',1,'cv::datasets::split()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0547c7fed86152d7e9d0096029c8518a',1,'split(const Mat &src, Mat *mvbegin)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8027f9deee1e42716be8039e5863fbd9',1,'split(InputArray m, OutputArrayOfArrays mv)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gabe5013d55d4ff586b20393913726179e',1,'split(InputArray src, GpuMat *dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaf1714e7a9ea0719c29bf378beaf5f99d',1,'split(InputArray src, std::vector< GpuMat > &dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html#gab5a8449f94bf741fb2b0a4f59ce1c81c',1,'split(const std::string &s, std::vector< std::string > &elems, char delim)(Global Namespace)']]], - ['split16u_1470',['split16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8cd402bcaf735ab84d5ad59051868add',1,'cv::hal::split16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8cd402bcaf735ab84d5ad59051868add',1,'split16u()(Global Namespace)']]], - ['split3_1471',['split3',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gabfeb794ff284b18121b2b755a5391892',1,'cv::gapi::split3()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gabfeb794ff284b18121b2b755a5391892',1,'split3()(Global Namespace)']]], - ['split32s_1472',['split32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfc4896c02badd30b7bba240188c684c',1,'cv::hal::split32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfc4896c02badd30b7bba240188c684c',1,'split32s()(Global Namespace)']]], - ['split4_1473',['split4',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gac87c9e2894c8b589eabc0ec2ac9d90eb',1,'cv::gapi::split4()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gac87c9e2894c8b589eabc0ec2ac9d90eb',1,'split4()(Global Namespace)']]], - ['split64s_1474',['split64s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac1622b7541f3084a053e12e0419bd88f',1,'cv::hal::split64s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac1622b7541f3084a053e12e0419bd88f',1,'split64s()(Global Namespace)']]], - ['split8u_1475',['split8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a989ec41345fcd2e66cc809fa9a4cb4',1,'cv::hal::split8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a989ec41345fcd2e66cc809fa9a4cb4',1,'split8u()(Global Namespace)']]], - ['split_5fcoeff_1476',['split_coeff',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a884c68fdde1552ace3e6f7a2e2452254',1,'cv::TrackerKCF::Params']]], - ['split_5ffn_5fimps_2ehpp_1477',['split_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01382.html',1,'']]], - ['split_5fjoin_5fcan_5fthrow_1478',['split_join_can_throw',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html#ace925c8be06b3640abb7b6f486290daba065162f99ac47cfa946b17a85f2e5f1e',1,'__gnu_pbds::container_traits']]], - ['split_5fmerge_2ehpp_1479',['split_merge.hpp',['https://docs.opencv.org/4.2.0/d6/d56/split__merge_8hpp.html',1,'']]], - ['splitlayer_1480',['SplitLayer',['https://docs.opencv.org/4.2.0/dd/df9/classcv_1_1dnn_1_1SplitLayer.html',1,'cv::dnn']]], - ['spointinoctavex_1481',['sPointInOctaveX',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#aadf42087a0908a900d34d9396037dc28',1,'cv::line_descriptor::KeyLine']]], - ['spointinoctavey_1482',['sPointInOctaveY',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a4d7fb8e09d606597d0af5a0df7e72087',1,'cv::line_descriptor::KeyLine']]], - ['spqr_1483',['SPQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html',1,'Eigen']]], - ['sputbackc_1484',['sputbackc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'__gnu_cxx::enc_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'__gnu_cxx::stdio_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'__gnu_cxx::stdio_sync_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_filebuf< char_type, traits_type >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_streambuf< _Elem, _Tr >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_streambuf< char, _Traits >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_streambuf< char, char_traits< char > >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::basic_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::basic_streambuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::basic_stringbuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::wbuffer_convert::sputbackc()']]], - ['sputc_1485',['sputc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'__gnu_cxx::enc_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'__gnu_cxx::stdio_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'__gnu_cxx::stdio_sync_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_filebuf< char_type, traits_type >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_streambuf< _Elem, _Tr >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_streambuf< char, _Traits >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_streambuf< char, char_traits< char > >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::basic_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::basic_streambuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::basic_stringbuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::wbuffer_convert::sputc()']]], - ['sputn_1486',['sputn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'__gnu_cxx::enc_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'__gnu_cxx::stdio_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'__gnu_cxx::stdio_sync_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_filebuf< char_type, traits_type >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_streambuf< _Elem, _Tr >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_streambuf< char, _Traits >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_streambuf< char, char_traits< char > >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::basic_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::basic_streambuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::basic_stringbuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::wbuffer_convert::sputn()']]], - ['sqr_1487',['sqr',['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1reg_1_1Mapper.html#a8905f76c21eff065d468bb63818f5f20',1,'cv::reg::Mapper::sqr()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga8aae233da90ce0ffe309ab8004342acb',1,'cv::cuda::sqr()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga8aae233da90ce0ffe309ab8004342acb',1,'sqr()(Global Namespace)']]], - ['sqr_5f_1488',['sqr_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb27ca55e895037b8a5f57d3f6b83fb9',1,'cv::cudev::sqr_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb27ca55e895037b8a5f57d3f6b83fb9',1,'sqr_()(Global Namespace)']]], - ['sqr_5ffunc_1489',['sqr_func',['https://docs.opencv.org/4.2.0/d9/d1d/structcv_1_1cudev_1_1sqr__func.html',1,'cv::cudev']]], - ['sqrboxfilter_1490',['sqrBoxFilter',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga76e863e7869912edbe88321253b72688',1,'cv::sqrBoxFilter()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga76e863e7869912edbe88321253b72688',1,'sqrBoxFilter()(Global Namespace)']]], - ['sqrintegral_1491',['sqrIntegral',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga40c75196202706399a60bf6ba7a052ac',1,'cv::cuda::sqrIntegral()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga40c75196202706399a60bf6ba7a052ac',1,'sqrIntegral()(Global Namespace)']]], - ['sqrsum_1492',['sqrSum',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga056c804ebf5d2eb9f6f35e3dcb01524c',1,'cv::cuda::sqrSum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga056c804ebf5d2eb9f6f35e3dcb01524c',1,'sqrSum()(Global Namespace)']]], - ['sqrt_1493',['sqrt',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad873dca860bd47baeeede8663e161b83',1,'Eigen::MatrixBase::sqrt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad873dca860bd47baeeede8663e161b83',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sqrt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad873dca860bd47baeeede8663e161b83',1,'MatrixBase< Solve< Decomposition, RhsType > >::sqrt()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga682082a1892db64a2856403ec17ba297',1,'cv::sqrt(const softfloat &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga021a8c75426f99035d767a68d258e12a',1,'cv::sqrt(const softdouble &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga186222c3919657890f88df5a1f64a7d7',1,'cv::sqrt(InputArray src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga09303680cb1a5521a922b6d392028d8c',1,'cv::cuda::sqrt()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc50a964cceb2c66902a54c327103421',1,'cv::cudev::sqrt(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e7258a055c96158790a168f7f80a97f',1,'cv::cudev::sqrt(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5636d655b66d1e528679dca9099cd0fa',1,'cv::cudev::sqrt(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb80681acb72738ed818f3f2d46b3fa2',1,'cv::cudev::sqrt(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5004527b61c574319714c7cef27adaf',1,'cv::cudev::sqrt(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga922fe16de9a9337ce89c38529cbf4bc2',1,'cv::cudev::sqrt(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f5651c2f477deab8c9a6a22480b0921',1,'cv::cudev::sqrt(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24082b6cad8f2ce48a688416553d4cee',1,'cv::cudev::sqrt(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa976ce20aaa72db500831bf5f7b07573',1,'cv::cudev::sqrt(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14bd8e08e3ed7e7eb27d443b7f561d99',1,'cv::cudev::sqrt(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37cd9743de393cb069367eb6eacfbd47',1,'cv::cudev::sqrt(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb4bf19688d464f9ca6762dcc5052764',1,'cv::cudev::sqrt(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0a7f7fea0c50ddf540b5e4d2652eb59',1,'cv::cudev::sqrt(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabca1ecf48e0d7efa0ef3a267169af3e9',1,'cv::cudev::sqrt(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546317b5fabb8dba6e03c186b29de6e',1,'cv::cudev::sqrt(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b7b4319ad51d28aa241f421d918a106',1,'cv::cudev::sqrt(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5445817fdef24e8f63fe154b3e0ff1db',1,'cv::cudev::sqrt(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf088d5ce5e1a99b65a2e563a1212985',1,'cv::cudev::sqrt(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bac73eee164c074617d7542a0328dff',1,'cv::cudev::sqrt(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf838bdac0e861508a4706edd78f2ff7e',1,'cv::cudev::sqrt(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf5cd21194f2cbaeaada72747bf04a0',1,'cv::cudev::sqrt(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79b759ff3cc2ae788b7cd28876b8f32f',1,'cv::cudev::sqrt(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c295b136a0161bcffd91a1b872b5e6d',1,'cv::cudev::sqrt(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8915709c6046b1de839b156c6a3e2fbd',1,'cv::cudev::sqrt(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadef80c222abf27a9e99b5dd50b6dd911',1,'cv::cudev::sqrt(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fdf1eb5d63c4bd6c0e9aa3826df4c56',1,'cv::cudev::sqrt(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819167f65c834bcb0aff3c93dbc3c6ff',1,'cv::cudev::sqrt(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dec14a6c836fe321ee6d34e43bcf63',1,'cv::cudev::sqrt(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc7ad959ab6a8987b12e7d5f74549864',1,'cv::cudev::sqrt(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf48bb6b8b4f2ec9160f153e00d413071',1,'cv::cudev::sqrt(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00f30f8a2dd3b6e7b2b423f4c77c5e88',1,'cv::cudev::sqrt(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6893715da72b11485bce57fc081add6',1,'cv::cudev::sqrt(const double3 &a)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaf3880c8feae9027fa91a701a1fd0d3b4',1,'cv::gapi::sqrt()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga186222c3919657890f88df5a1f64a7d7',1,'sqrt(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga682082a1892db64a2856403ec17ba297',1,'sqrt(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga021a8c75426f99035d767a68d258e12a',1,'sqrt(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaf3880c8feae9027fa91a701a1fd0d3b4',1,'sqrt(const GMat &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga09303680cb1a5521a922b6d392028d8c',1,'sqrt(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc50a964cceb2c66902a54c327103421',1,'sqrt(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e7258a055c96158790a168f7f80a97f',1,'sqrt(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5636d655b66d1e528679dca9099cd0fa',1,'sqrt(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb80681acb72738ed818f3f2d46b3fa2',1,'sqrt(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5004527b61c574319714c7cef27adaf',1,'sqrt(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga922fe16de9a9337ce89c38529cbf4bc2',1,'sqrt(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f5651c2f477deab8c9a6a22480b0921',1,'sqrt(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24082b6cad8f2ce48a688416553d4cee',1,'sqrt(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa976ce20aaa72db500831bf5f7b07573',1,'sqrt(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14bd8e08e3ed7e7eb27d443b7f561d99',1,'sqrt(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37cd9743de393cb069367eb6eacfbd47',1,'sqrt(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb4bf19688d464f9ca6762dcc5052764',1,'sqrt(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0a7f7fea0c50ddf540b5e4d2652eb59',1,'sqrt(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabca1ecf48e0d7efa0ef3a267169af3e9',1,'sqrt(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546317b5fabb8dba6e03c186b29de6e',1,'sqrt(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b7b4319ad51d28aa241f421d918a106',1,'sqrt(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5445817fdef24e8f63fe154b3e0ff1db',1,'sqrt(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf088d5ce5e1a99b65a2e563a1212985',1,'sqrt(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bac73eee164c074617d7542a0328dff',1,'sqrt(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf838bdac0e861508a4706edd78f2ff7e',1,'sqrt(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf5cd21194f2cbaeaada72747bf04a0',1,'sqrt(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79b759ff3cc2ae788b7cd28876b8f32f',1,'sqrt(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c295b136a0161bcffd91a1b872b5e6d',1,'sqrt(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8915709c6046b1de839b156c6a3e2fbd',1,'sqrt(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadef80c222abf27a9e99b5dd50b6dd911',1,'sqrt(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fdf1eb5d63c4bd6c0e9aa3826df4c56',1,'sqrt(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819167f65c834bcb0aff3c93dbc3c6ff',1,'sqrt(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dec14a6c836fe321ee6d34e43bcf63',1,'sqrt(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc7ad959ab6a8987b12e7d5f74549864',1,'sqrt(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf48bb6b8b4f2ec9160f153e00d413071',1,'sqrt(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00f30f8a2dd3b6e7b2b423f4c77c5e88',1,'sqrt(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6893715da72b11485bce57fc081add6',1,'sqrt(const double3 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf91cd3409ab242d469bcc1b2d06624c3',1,'std::sqrt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf91cd3409ab242d469bcc1b2d06624c3',1,'sqrt()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af4f536e8ea56702e63088efb3706d1f0',1,'Eigen::sqrt()']]], - ['sqrt32f_1494',['sqrt32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga99f1449955e5dd00966f4e37fbf72027',1,'cv::hal::sqrt32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga99f1449955e5dd00966f4e37fbf72027',1,'sqrt32f()(Global Namespace)']]], - ['sqrt64f_1495',['sqrt64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2343231151ea0b652a3aa38f0b57b9e1',1,'cv::hal::sqrt64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2343231151ea0b652a3aa38f0b57b9e1',1,'sqrt64f()(Global Namespace)']]], - ['sqrt_5f_1496',['sqrt_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa26d03e4b54bae8b41de6946e64583',1,'cv::cudev::sqrt_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa26d03e4b54bae8b41de6946e64583',1,'sqrt_()(Global Namespace)']]], - ['sqrt_5ffunc_1497',['sqrt_func',['https://docs.opencv.org/4.2.0/d9/d47/structcv_1_1cudev_1_1sqrt__func.html',1,'cv::cudev']]], - ['sqrt_5ffunc_3c_20double_20_3e_1498',['sqrt_func< double >',['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1cudev_1_1sqrt__func_3_01double_01_4.html',1,'cv::cudev']]], - ['sqrt_5ffunc_3c_20float_20_3e_1499',['sqrt_func< float >',['https://docs.opencv.org/4.2.0/d8/dd2/structcv_1_1cudev_1_1sqrt__func_3_01float_01_4.html',1,'cv::cudev']]], - ['sqrt_5ffunc_3c_20schar_20_3e_1500',['sqrt_func< schar >',['https://docs.opencv.org/4.2.0/da/d64/structcv_1_1cudev_1_1sqrt__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['sqrt_5ffunc_3c_20short_20_3e_1501',['sqrt_func< short >',['https://docs.opencv.org/4.2.0/d2/d6a/structcv_1_1cudev_1_1sqrt__func_3_01short_01_4.html',1,'cv::cudev']]], - ['sqrt_5ffunc_3c_20uchar_20_3e_1502',['sqrt_func< uchar >',['https://docs.opencv.org/4.2.0/d9/d33/structcv_1_1cudev_1_1sqrt__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['sqrt_5ffunc_3c_20uint_20_3e_1503',['sqrt_func< uint >',['https://docs.opencv.org/4.2.0/d0/d7b/structcv_1_1cudev_1_1sqrt__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['sqrt_5ffunc_3c_20ushort_20_3e_1504',['sqrt_func< ushort >',['https://docs.opencv.org/4.2.0/df/df4/structcv_1_1cudev_1_1sqrt__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['square_1505',['square',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af28ef8cae3b37bcf1b47910cd6f20d4c',1,'Eigen']]], - ['square_20chessboard_1506',['Camera calibration with square chessboard',['https://docs.opencv.org/4.2.0/dc/d43/tutorial_camera_calibration_square_chess.html',1,'']]], - ['square_20root_20calculation_1507',['Inverse square root calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'']]], - ['square_20root_20calculation_1508',['Square root calculation',['https://docs.opencv.org/4.2.0/d5/dc3/group__core__hal__interface__sqrt.html',1,'']]], - ['squareddistance_1509',['squaredDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a5cb6544a7fff4c3571c0a5eb82eec8bb',1,'Eigen::ParametrizedLine']]], - ['squaredexteriordistance_1510',['squaredExteriorDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#aa91643da79398e454618ad06b92ff531',1,'Eigen::AlignedBox::squaredExteriorDistance(const AlignedBox &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a845dd8a069c204d15f12aa2702dd9539',1,'Eigen::AlignedBox::squaredExteriorDistance(const MatrixBase< Derived > &p) const']]], - ['squarednorm_1511',['squaredNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac8da566526419f9742a6c471bbd87e0a',1,'Eigen::MatrixBase::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac8da566526419f9742a6c471bbd87e0a',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac8da566526419f9742a6c471bbd87e0a',1,'MatrixBase< Solve< Decomposition, RhsType > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'Eigen::QuaternionBase::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'Eigen::VectorwiseOp::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Derived, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Derived, Vertical >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::squaredNorm()']]], - ['squares_20systems_1512',['Solving linear least squares systems',['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'']]], - ['squaresize_1513',['squareSize',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#aa2538d0677c62ce5ab7b5c0569c1afba',1,'cv::CirclesGridFinderParameters']]], - ['sr_5fbenchmark_2emarkdown_1514',['sr_benchmark.markdown',['https://docs.opencv.org/4.2.0/d0/d3b/sr__benchmark_8markdown.html',1,'']]], - ['sr_5fbsds_1515',['SR_bsds',['https://docs.opencv.org/4.2.0/d6/d05/classcv_1_1datasets_1_1SR__bsds.html',1,'cv::datasets']]], - ['sr_5fbsds_2ehpp_1516',['sr_bsds.hpp',['https://docs.opencv.org/4.2.0/d2/d03/sr__bsds_8hpp.html',1,'']]], - ['sr_5fbsdsobj_1517',['SR_bsdsObj',['https://docs.opencv.org/4.2.0/dc/d1e/structcv_1_1datasets_1_1SR__bsdsObj.html',1,'cv::datasets']]], - ['sr_5fcross_1518',['SR_CROSS',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggabd57af723cddf921d0c0601a6e8e789ba9d59164b49e3adbe1031a21d65053edb',1,'cv::optflow::SR_CROSS'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggabd57af723cddf921d0c0601a6e8e789ba9d59164b49e3adbe1031a21d65053edb',1,'SR_CROSS(Global Namespace)']]], - ['sr_5fdiv2k_1519',['SR_div2k',['https://docs.opencv.org/4.2.0/d2/db5/classcv_1_1datasets_1_1SR__div2k.html',1,'cv::datasets']]], - ['sr_5fdiv2k_2ehpp_1520',['sr_div2k.hpp',['https://docs.opencv.org/4.2.0/db/d8f/sr__div2k_8hpp.html',1,'']]], - ['sr_5fdiv2kobj_1521',['SR_div2kObj',['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1datasets_1_1SR__div2kObj.html',1,'cv::datasets']]], - ['sr_5ffixed_1522',['SR_FIXED',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggabd57af723cddf921d0c0601a6e8e789ba039f4856c9cd55fdd1a50c20885f046b',1,'cv::optflow::SR_FIXED'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggabd57af723cddf921d0c0601a6e8e789ba039f4856c9cd55fdd1a50c20885f046b',1,'SR_FIXED(Global Namespace)']]], - ['sr_5fgeneral100_1523',['SR_general100',['https://docs.opencv.org/4.2.0/d5/d19/classcv_1_1datasets_1_1SR__general100.html',1,'cv::datasets']]], - ['sr_5fgeneral100_2ehpp_1524',['sr_general100.hpp',['https://docs.opencv.org/4.2.0/d4/d6b/sr__general100_8hpp.html',1,'']]], - ['sr_5fgeneral100obj_1525',['SR_general100Obj',['https://docs.opencv.org/4.2.0/da/dad/structcv_1_1datasets_1_1SR__general100Obj.html',1,'cv::datasets']]], - ['src_1526',['src',['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#ad8f380e5494fafe97dc049e4c416a2d0',1,'cv::cudev::BrdBase::src'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#a0e461dcbe6609290f44f0dd0cfdfe014',1,'cv::cudev::BrdConstant::src'],['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#a28a7a5450092bac2259f9e70fd5a74d1',1,'cv::cudev::CommonAreaInterPtr::src'],['https://docs.opencv.org/4.2.0/dd/d49/structcv_1_1cudev_1_1CountNonZeroExprBody.html#afe56646189c220ebc5d8e726067af322',1,'cv::cudev::CountNonZeroExprBody::src'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1CubicInterPtr.html#ac52c1728bef16b9b5fc5d76b5fa33325',1,'cv::cudev::CubicInterPtr::src'],['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1cudev_1_1DerivXPtr.html#a0c246f64f78809e0c62df773b4333966',1,'cv::cudev::DerivXPtr::src'],['https://docs.opencv.org/4.2.0/dc/d51/structcv_1_1cudev_1_1DerivYPtr.html#aa1e78c23ab24dcb531bc1d4f8b1298db',1,'cv::cudev::DerivYPtr::src'],['https://docs.opencv.org/4.2.0/d9/d48/structcv_1_1cudev_1_1FindMaxValExprBody.html#abe30e0e2659e3bb8fe34c95f06fea1db',1,'cv::cudev::FindMaxValExprBody::src'],['https://docs.opencv.org/4.2.0/dd/db3/structcv_1_1cudev_1_1FindMinMaxValExprBody.html#a27b8cc71a6d60bb5f7cf96ac537302aa',1,'cv::cudev::FindMinMaxValExprBody::src'],['https://docs.opencv.org/4.2.0/df/d82/structcv_1_1cudev_1_1FindMinValExprBody.html#ac65c776d8fe0e31840e4a1adc7b85828',1,'cv::cudev::FindMinValExprBody::src'],['https://docs.opencv.org/4.2.0/d9/dea/structcv_1_1cudev_1_1HistogramBody.html#a835b34b72a6e8cc23c2c9a6f400a6713',1,'cv::cudev::HistogramBody::src'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#a4bbe7a71b855ad501e2094559d58b6c6',1,'cv::cudev::IntegerAreaInterPtr::src'],['https://docs.opencv.org/4.2.0/d3/dde/structcv_1_1cudev_1_1IntegralBody.html#ab9411704ac319d52eed01b35cdc2a298',1,'cv::cudev::IntegralBody::src'],['https://docs.opencv.org/4.2.0/d0/de6/structcv_1_1cudev_1_1LaplacianPtr_3_011_00_01SrcPtr_01_4.html#a5d3403e2a9f0bf0884a715e4224fa1e9',1,'cv::cudev::LaplacianPtr< 1, SrcPtr >::src'],['https://docs.opencv.org/4.2.0/d4/d89/structcv_1_1cudev_1_1LaplacianPtr_3_013_00_01SrcPtr_01_4.html#a33991dc92063cf0e67005497b259e93c',1,'cv::cudev::LaplacianPtr< 3, SrcPtr >::src'],['https://docs.opencv.org/4.2.0/d7/d8a/structcv_1_1cudev_1_1LinearInterPtr.html#a803c0787533b510decf2ff784d6658c0',1,'cv::cudev::LinearInterPtr::src'],['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html#a57c863b2fef18a0496ce850f595e6573',1,'cv::cudev::LutPtr::src'],['https://docs.opencv.org/4.2.0/d0/df5/structcv_1_1cudev_1_1NearestInterPtr.html#a846c935d96545401f78d7505059df913',1,'cv::cudev::NearestInterPtr::src'],['https://docs.opencv.org/4.2.0/d1/d8a/structcv_1_1cudev_1_1PyrDownBody.html#a4475b1f0b499cfd4ca2b2fdb46818998',1,'cv::cudev::PyrDownBody::src'],['https://docs.opencv.org/4.2.0/d1/de8/structcv_1_1cudev_1_1PyrUpBody.html#ad8fbeac8f5d64ac603e122efc4183616',1,'cv::cudev::PyrUpBody::src'],['https://docs.opencv.org/4.2.0/d5/df4/structcv_1_1cudev_1_1ReduceToColumnBody.html#aa72b57549923cafbecfcb80c3d3849bd',1,'cv::cudev::ReduceToColumnBody::src'],['https://docs.opencv.org/4.2.0/da/d58/structcv_1_1cudev_1_1ReduceToRowBody.html#ae6544f765538d7a70af86a0c6c9b226e',1,'cv::cudev::ReduceToRowBody::src'],['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html#a1bb3834387ca5de2f8203beb166d26b3',1,'cv::cudev::RemapPtr1::src'],['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#ab2019553ffaaa44a94da9bcb69317fce',1,'cv::cudev::RemapPtr2::src'],['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#a74b6f1bae461e40b5bcd751b5802a219',1,'cv::cudev::ResizePtr::src'],['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1ScharrXPtr.html#a9fc7f2466fbe547c1eda7c466d513128',1,'cv::cudev::ScharrXPtr::src'],['https://docs.opencv.org/4.2.0/d0/d70/structcv_1_1cudev_1_1ScharrYPtr.html#ace8f6213d3a601a401acea4dd2f7e5db',1,'cv::cudev::ScharrYPtr::src'],['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1SobelXPtr.html#aa965d2eb5adc35fa068158328ddae626',1,'cv::cudev::SobelXPtr::src'],['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1SobelYPtr.html#a332a972a71fc04af4791d58a1e00ad14',1,'cv::cudev::SobelYPtr::src'],['https://docs.opencv.org/4.2.0/dd/d33/structcv_1_1cudev_1_1SumExprBody.html#ab272adfc6687ba7156bc914238f79299',1,'cv::cudev::SumExprBody::src'],['https://docs.opencv.org/4.2.0/d2/d40/structcv_1_1cudev_1_1TransposeBody.html#a18b80215a5fde29be9e39153fb1699a4',1,'cv::cudev::TransposeBody::src'],['https://docs.opencv.org/4.2.0/dd/d01/structcv_1_1cudev_1_1UnaryTransformPtr.html#aaa7399d4841ac33ec7469c162753e97c',1,'cv::cudev::UnaryTransformPtr::src']]], - ['src1_1527',['src1',['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#a7b2d04ddb90892992ece567566b0bebf',1,'cv::cudev::BinaryTransformPtr']]], - ['src2_1528',['src2',['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#a5f65cb3b9fc7d2216dc6951294545989',1,'cv::cudev::BinaryTransformPtr']]], - ['src_5fimg_5fidx_1529',['src_img_idx',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#a3b89533af56dcc765e0f826a056b0c1f',1,'cv::detail::MatchesInfo']]], - ['srcbw_1530',['srcBw',['https://docs.opencv.org/4.2.0/d8/d65/structcv_1_1datasets_1_1IS__weizmannObj.html#aaa10679fcb8ecda4305025192c6b90e7',1,'cv::datasets::IS_weizmannObj']]], - ['srccolor_1531',['srcColor',['https://docs.opencv.org/4.2.0/d8/d65/structcv_1_1datasets_1_1IS__weizmannObj.html#a984317c8df2da404c1d50856948bf816',1,'cv::datasets::IS_weizmannObj']]], - ['sregex_5ftoken_5fiterator_1532',['sregex_token_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa39e71a0a921a1f5b6e106613346195c',1,'std::sregex_token_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa39e71a0a921a1f5b6e106613346195c',1,'sregex_token_iterator(Global Namespace)']]], - ['sse_20utilities_1533',['SSE utilities',['https://docs.opencv.org/4.2.0/d6/d06/group__core__utils__sse.html',1,'']]], - ['sse_5futils_2ehpp_1534',['sse_utils.hpp',['https://docs.opencv.org/4.2.0/d2/d0d/sse__utils_8hpp.html',1,'']]], - ['ssim_20on_20the_20gpu_1535',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], - ['sso_5fstring_5fbase_2eh_1536',['sso_string_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01082.html',1,'']]], - ['sstream_1537',['sstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00140.html',1,'']]], - ['sstream_2etcc_1538',['sstream.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00518.html',1,'']]], - ['ssub_5fmatch_1539',['ssub_match',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1339fbccc0b05ed8cfe8c3afa83e9a4b',1,'std::ssub_match'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1339fbccc0b05ed8cfe8c3afa83e9a4b',1,'ssub_match(Global Namespace)']]], - ['st_5fbilinear_1540',['ST_BILINEAR',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggaac4a33e26da30a5c5aa1ed3f66fc0998a412f292ae2101f5fd3de778cc597c13c',1,'cv::optflow::ST_BILINEAR'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggaac4a33e26da30a5c5aa1ed3f66fc0998a412f292ae2101f5fd3de778cc597c13c',1,'ST_BILINEAR(Global Namespace)']]], - ['st_5fstandart_1541',['ST_STANDART',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggaac4a33e26da30a5c5aa1ed3f66fc0998aa4c47a58f231a484eff77183148908a2',1,'cv::optflow::ST_STANDART'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggaac4a33e26da30a5c5aa1ed3f66fc0998aa4c47a58f231a484eff77183148908a2',1,'ST_STANDART(Global Namespace)']]], - ['stabilization_1542',['Video Stabilization',['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html',1,'']]], - ['stabilizationmotions_1543',['stabilizationMotions',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a43591cd4c8e8a8efa749950adc86697c',1,'cv::videostab::InpainterBase::stabilizationMotions()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a24db866bac68dab9e8684a6df9b68638',1,'cv::videostab::WobbleSuppressorBase::stabilizationMotions()']]], - ['stabilizationmotions_5f_1544',['stabilizationMotions_',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#ab778e2b654dbd54e36bb0aea388914ef',1,'cv::videostab::InpainterBase::stabilizationMotions_'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aeb86f1064652cceb6f9a1735a81da5af',1,'cv::videostab::StabilizerBase::stabilizationMotions_'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#aab16261a43fe5585cff7e2dc0b26e161',1,'cv::videostab::WobbleSuppressorBase::stabilizationMotions_']]], - ['stabilize_1545',['stabilize',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1videostab_1_1GaussianMotionFilter.html#a0549d542dcf377187cdd00b9c6fd72db',1,'cv::videostab::GaussianMotionFilter::stabilize()'],['https://docs.opencv.org/4.2.0/d0/df6/classcv_1_1videostab_1_1IMotionStabilizer.html#a5a2e7cd903bf6297e6775a60a8bcf641',1,'cv::videostab::IMotionStabilizer::stabilize()'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a84553c7288378145589c97bb5a9125fe',1,'cv::videostab::LpMotionStabilizer::stabilize()'],['https://docs.opencv.org/4.2.0/dd/df4/classcv_1_1videostab_1_1MotionFilterBase.html#a6bcb77ecfd36ed88cc494b953596ce4e',1,'cv::videostab::MotionFilterBase::stabilize(int idx, const std::vector< Mat > &motions, std::pair< int, int > range)=0'],['https://docs.opencv.org/4.2.0/dd/df4/classcv_1_1videostab_1_1MotionFilterBase.html#acbf3a7e9245d79966ba7691bcb67fd11',1,'cv::videostab::MotionFilterBase::stabilize(int size, const std::vector< Mat > &motions, std::pair< int, int > range, Mat *stabilizationMotions) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d9/d76/classcv_1_1videostab_1_1MotionStabilizationPipeline.html#a3f4d3891b05955cd17d213dfcbca9ba1',1,'cv::videostab::MotionStabilizationPipeline::stabilize()']]], - ['stabilizedframes_1546',['stabilizedFrames',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#ab485476a24a32bcf7aaae31ce5669cb0',1,'cv::videostab::InpainterBase']]], - ['stabilizedframes_5f_1547',['stabilizedFrames_',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a83e696d92ba2329bec22047f9298f2fb',1,'cv::videostab::InpainterBase::stabilizedFrames_'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#afbf3e2dd807b19647b545585cf0dbd3e',1,'cv::videostab::StabilizerBase::stabilizedFrames_']]], - ['stabilizedmasks_5f_1548',['stabilizedMasks_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ac77d036c0a94ca9b34ae8f8c69ac220d',1,'cv::videostab::StabilizerBase']]], - ['stabilizeframe_1549',['stabilizeFrame',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aff4ee85e72d58fb3eb09c0f5c8a9314c',1,'cv::videostab::StabilizerBase']]], - ['stabilizer_2ehpp_1550',['stabilizer.hpp',['https://docs.opencv.org/4.2.0/da/dde/stabilizer_8hpp.html',1,'']]], - ['stabilizerbase_1551',['StabilizerBase',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html',1,'cv::videostab::StabilizerBase'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aac79382ab3f87247ddc01fe0aa86ea64',1,'cv::videostab::StabilizerBase::StabilizerBase()']]], - ['stable_5fpartition_1552',['stable_partition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga4396b91f26c7aaf0ae150a79ebd965b7',1,'std::stable_partition()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga4396b91f26c7aaf0ae150a79ebd965b7',1,'stable_partition()(Global Namespace)']]], - ['stable_5fsort_1553',['stable_sort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7d8bb8e52b7b0e80301dcbec17225b4a',1,'std::stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a3ce3aa8ac2297f8290939a7988596d',1,'std::stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7d8bb8e52b7b0e80301dcbec17225b4a',1,'stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a3ce3aa8ac2297f8290939a7988596d',1,'stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['stablenorm_1554',['stableNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab84d3e64f855813b1eea4202c0697dc1',1,'Eigen::MatrixBase::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab84d3e64f855813b1eea4202c0697dc1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab84d3e64f855813b1eea4202c0697dc1',1,'MatrixBase< Solve< Decomposition, RhsType > >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'Eigen::VectorwiseOp::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Derived, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Derived, Vertical >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::stableNorm()']]], - ['stablenormalize_1555',['stableNormalize',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0b1443fa322615379557ade3399a3c3c',1,'Eigen::MatrixBase::stableNormalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0b1443fa322615379557ade3399a3c3c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::stableNormalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0b1443fa322615379557ade3399a3c3c',1,'MatrixBase< Solve< Decomposition, RhsType > >::stableNormalize()']]], - ['stablenormalized_1556',['stableNormalized',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a399dca938633b9f8df5ec4beefeccec0',1,'Eigen::MatrixBase::stableNormalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a399dca938633b9f8df5ec4beefeccec0',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::stableNormalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a399dca938633b9f8df5ec4beefeccec0',1,'MatrixBase< Solve< Decomposition, RhsType > >::stableNormalized()']]], - ['stack_1557',['stack',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html',1,'std::stack< _Tp, _Sequence >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00143.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#ad95ef4166cdb0aa8bae1dcd7ae2839e4',1,'stack< _StateSeqT >::stack()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#ad95ef4166cdb0aa8bae1dcd7ae2839e4',1,'std::stack::stack()']]], - ['stack_20alignment_1558',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], - ['stack_3c_20_5fstateseqt_20_3e_1559',['stack< _StateSeqT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html',1,'']]], - ['stages_5fn_1560',['stages_n',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a63cbf9168f863178bba4e2eaddf79ac0',1,'cv::face::FacemarkLBF::Params']]], - ['standard_20backends_1561',['G-API Standard Backends',['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html',1,'']]], - ['standard_5fpolicies_2ehpp_1562',['standard_policies.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01151.html',1,'']]], - ['standardcollector_1563',['StandardCollector',['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html',1,'cv::face::StandardCollector'],['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#a24e397f05bbfaa973ab519d000e559c6',1,'cv::face::StandardCollector::StandardCollector()']]], - ['standardcompressedformat_1564',['StandardCompressedFormat',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a4b73fd62205603cef3ab78a3e66c5941abd3632507a3697fb48c77eff79851a74',1,'Eigen']]], - ['starcensustransform_1565',['starCensusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6e3b6dac980497890a61871f3ad90ecb',1,'cv::stereo::starCensusTransform(const cv::Mat &img1, const cv::Mat &img2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2)'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#af1ad2e7309e42a42e92d65e13bb526ff',1,'cv::stereo::starCensusTransform(const cv::Mat &img1, int kernelSize, cv::Mat &dist)']]], - ['stardetector_1566',['StarDetector',['https://docs.opencv.org/4.2.0/dd/d39/classcv_1_1xfeatures2d_1_1StarDetector.html',1,'cv::xfeatures2d']]], - ['starkernelcensus_1567',['StarKernelCensus',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1stereo_1_1StarKernelCensus.html',1,'cv::stereo::StarKernelCensus< num_images >'],['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1stereo_1_1StarKernelCensus.html#af3ec4d3ebcfc04a3dcbd64c7139f8e23',1,'cv::stereo::StarKernelCensus::StarKernelCensus()']]], - ['start_1568',['start',['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#ad7ce51f1d8797236c97bec49d2b25522',1,'cv::Range::start'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ac979183ede9856427ea8309a91843eaf',1,'cv::GStreamingCompiled::start()'],['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html#a564bc8b0bebcfc6c96f85fc48643e273',1,'cv::TickMeter::start()'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#a73a454d6769e4007da648d984e3193ce',1,'cv::ocl::Timer::start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5f0b7200c4a68f9b939ae84060439707',1,'std::gslice::start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac5e75a2dd40a49ee555fc35d0eeacc1a',1,'std::slice::start()'],['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html#a87f6bd02c5d093b812c0d4790b2181f3',1,'net::mc::tasks::PowerRepeatTask::start()'],['../classnet_1_1websocket_1_1SingleClientWSServer.html#ae5f4b4ef17fb26725e0c6d52909ec9da',1,'net::websocket::SingleClientWSServer::start()'],['../classutil_1_1AsyncTask.html#abe5a114fae049066657d73ccbdd9f3c3',1,'util::AsyncTask::start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac5e75a2dd40a49ee555fc35d0eeacc1a',1,'start()(Global Namespace)']]], - ['start_5farray_1569',['start_array',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a5c53878cf08d463eb4e7ca0270532572.html#a5c53878cf08d463eb4e7ca0270532572',1,'nlohmann::json_sax']]], - ['start_5fauto_5fstep_1570',['START_AUTO_STEP',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a9eb75f61c3e1c55d7d541e14297a0241a5d4e8becb341736fc233b0dc1918ac94',1,'cv::ml::EM']]], - ['start_5fe_5fstep_1571',['START_E_STEP',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a9eb75f61c3e1c55d7d541e14297a0241abade5584fe2152c34ea1ee175691f98c',1,'cv::ml::EM']]], - ['start_5fm_5fstep_1572',['START_M_STEP',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a9eb75f61c3e1c55d7d541e14297a0241a628d2a6f1e5bb6dd0dd1847345d968d2',1,'cv::ml::EM']]], - ['start_5fobject_1573',['start_object',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a0671528b0debb5a348169d61f0382a0f.html#a0671528b0debb5a348169d61f0382a0f',1,'nlohmann::json_sax']]], - ['started_1574',['Started',['https://docs.opencv.org/4.2.0/d4/d73/tutorial_py_contours_begin.html',1,'Contours : Getting Started'],['https://docs.opencv.org/4.2.0/d5/daa/tutorial_js_contours_begin.html',1,'Contours : Getting Started']]], - ['started_1575',['Getting started',['https://eigen.tuxfamily.org/dox/GettingStarted.html',1,'']]], - ['started_20with_20images_1576',['Started with Images',['https://docs.opencv.org/4.2.0/dc/d2e/tutorial_py_image_display.html',1,'Getting Started with Images'],['https://docs.opencv.org/4.2.0/df/d24/tutorial_js_image_display.html',1,'Getting Started with Images']]], - ['started_20with_20videos_1577',['Started with Videos',['https://docs.opencv.org/4.2.0/dd/d43/tutorial_py_video_display.html',1,'Getting Started with Videos'],['https://docs.opencv.org/4.2.0/dd/d00/tutorial_js_video_display.html',1,'Getting Started with Videos']]], - ['startidxs_1578',['startIdxs',['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a2612b67a491c05d726db05492c45476f',1,'cv::DescriptorMatcher::DescriptorCollection']]], - ['startloop_1579',['startLoop',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gae1ae035082d76c7fb981203a974bd4ba',1,'cv::startLoop()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gae1ae035082d76c7fb981203a974bd4ba',1,'startLoop()(Global Namespace)']]], - ['startpointx_1580',['startPointX',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a300d7487fced03e0f781afbad5f6e67d',1,'cv::line_descriptor::KeyLine']]], - ['startpointy_1581',['startPointY',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#ac36c0fe32df87388d9fa6a8def75f7e4',1,'cv::line_descriptor::KeyLine']]], - ['startwindowthread_1582',['startWindowThread',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga2c6ecef4f85d8e5cbefec39c9e82ece0',1,'cv::startWindowThread()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga2c6ecef4f85d8e5cbefec39c9e82ece0',1,'startWindowThread()(Global Namespace)']]], - ['startwriteavi_1583',['startWriteAVI',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a96eb46757885d235b924d0e246d66ceb',1,'cv::AVIWriteContainer']]], - ['startwritechunk_1584',['startWriteChunk',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a0628cd9ee5dcb6997dd233fc370e171c',1,'cv::AVIWriteContainer']]], - ['startwritestruct_1585',['startWriteStruct',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a8bb8183cb82d1b3de9eceb13e44efbae',1,'cv::FileStorage']]], - ['state_1586',['state',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa53ac52fa536aeabba795a2164a11337',1,'cv::FileStorage::state'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a993bd2e6a5a9b8f3b37ba6049b523136',1,'cv::RNG::state'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a4e97b157edf8205bcc60347a86c9ed86',1,'std::fpos::state(_StateT __st)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#ab0b8ab377a6907428414353bca366234',1,'std::fpos::state() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05907.html#a9d0d2e818e6d6cc0b32e86c984561e6f',1,'std::wbuffer_convert::state()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#abd1382f21442adec3f9935d023017871',1,'std::wstring_convert::state()']]], - ['state_1587',['State',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ab25ab28a95a47dd9cd9e26e71398dd3f',1,'cv::FileStorage']]], - ['stateconversionfunction_1588',['stateConversionFunction',['https://docs.opencv.org/4.2.0/da/d2b/classcv_1_1tracking_1_1UkfSystemModel.html#a5ab724eda5b79639eddcea6351c612fd',1,'cv::tracking::UkfSystemModel']]], - ['stateestimator_1589',['stateEstimator',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#ab25e2e36eaba6e155f7227712e8ff178',1,'cv::TrackerModel']]], - ['statefuncjacobianw_1590',['stateFuncJacobianW',['../classfilters_1_1ExtendedKalmanFilter.html#ac476587c0045b7382b0fb62c4323c26c',1,'filters::ExtendedKalmanFilter']]], - ['statefuncjacobianx_1591',['stateFuncJacobianX',['../classfilters_1_1ExtendedKalmanFilter.html#ac4661be6187111039f681ef5afb8a233',1,'filters::ExtendedKalmanFilter']]], - ['stateinit_1592',['stateInit',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a5e0d0f4982531e761f8934c97fe15689',1,'cv::tracking::UnscentedKalmanFilterParams']]], - ['statepost_1593',['statePost',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#add8fb5ac9c04b4600b679698dcb0447d',1,'cv::KalmanFilter']]], - ['statepre_1594',['statePre',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a926dece64b4e0e28c3f58af8b7793669',1,'cv::KalmanFilter']]], - ['static_5fpointer_5fcast_1595',['static_pointer_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6a221c308f0ca0e44b5fffa32a6d4595',1,'std']]], - ['staticsaliency_1596',['StaticSaliency',['https://docs.opencv.org/4.2.0/d5/d87/classcv_1_1saliency_1_1StaticSaliency.html',1,'cv::saliency']]], - ['staticsaliencyfinegrained_1597',['StaticSaliencyFineGrained',['https://docs.opencv.org/4.2.0/da/dd0/classcv_1_1saliency_1_1StaticSaliencyFineGrained.html',1,'cv::saliency::StaticSaliencyFineGrained'],['https://docs.opencv.org/4.2.0/da/dd0/classcv_1_1saliency_1_1StaticSaliencyFineGrained.html#a282bc38fecc2a3d158b38eeadb289a00',1,'cv::saliency::StaticSaliencyFineGrained::StaticSaliencyFineGrained()']]], - ['staticsaliencyspectralresidual_1598',['StaticSaliencySpectralResidual',['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html',1,'cv::saliency::StaticSaliencySpectralResidual'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#a5d691bad0bad797e0bbc0a0673987f54',1,'cv::saliency::StaticSaliencySpectralResidual::StaticSaliencySpectralResidual()']]], - ['statmodel_1599',['StatModel',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html',1,'cv::ml']]], - ['status_1600',['Status',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a507409ce9435dd89857469d12ec06b45',1,'cv::Stitcher']]], - ['status_1601',['status',['https://docs.opencv.org/4.2.0/d1/dda/structcv_1_1DetectionBasedTracker_1_1ExtObject.html#a4745083b1749d5b303e2a2c4edc2462b',1,'cv::DetectionBasedTracker::ExtObject']]], - ['std_1602',['std',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html',1,'std'],['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html#ab7ef42d452e4daacd38a27f0c26ae7a7',1,'cv::TrackerSamplerPF::Params::std']]], - ['std_3a_3a_5f_5fdebug_1603',['__debug',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html',1,'std']]], - ['std_3a_3a_5f_5fdetail_1604',['__detail',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html',1,'std']]], - ['std_3a_3a_5f_5fexception_5fptr_1605',['__exception_ptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05491.html',1,'std']]], - ['std_3a_3a_5f_5fparallel_1606',['__parallel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01581.html',1,'std']]], - ['std_3a_3a_5f_5fprofile_1607',['__profile',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html',1,'std']]], - ['std_3a_3a_5fv2_1608',['_V2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02059.html',1,'std']]], - ['std_3a_3achrono_1609',['chrono',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html',1,'std']]], - ['std_3a_3achrono_3a_3a_5fv2_1610',['_V2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01915.html',1,'std::chrono']]], - ['std_3a_3adecimal_1611',['decimal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01584.html',1,'std']]], - ['std_3a_3aexperimental_1612',['experimental',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09859.html',1,'std']]], - ['std_3a_3aexperimental_3a_3afilesystem_1613',['filesystem',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09859.html',1,'std::experimental']]], - ['std_3a_3aexperimental_3a_3afilesystem_3a_3av1_1614',['v1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09859.html',1,'std::experimental::filesystem']]], - ['std_3a_3aexperimental_3a_3afundamentals_5fv1_1615',['fundamentals_v1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10103.html',1,'std::experimental']]], - ['std_3a_3aexperimental_3a_3afundamentals_5fv2_1616',['fundamentals_v2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10023.html',1,'std::experimental']]], - ['std_3a_3aplaceholders_1617',['placeholders',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01565.html',1,'std']]], - ['std_3a_3aregex_5fconstants_1618',['regex_constants',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html',1,'std']]], - ['std_3a_3arel_5fops_1619',['rel_ops',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html',1,'std']]], - ['std_3a_3athis_5fthread_1620',['this_thread',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01566.html',1,'std']]], - ['std_3a_3atr1_1621',['tr1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01550.html',1,'std']]], - ['std_3a_3atr1_3a_3a_5f_5fdetail_1622',['__detail',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01551.html',1,'std::tr1']]], - ['std_3a_3atr2_1623',['tr2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01552.html',1,'std']]], - ['std_3a_3atr2_3a_3a_5f_5fdetail_1624',['__detail',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01553.html',1,'std::tr2']]], - ['std_5fabs_2eh_1625',['std_abs.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00521.html',1,'']]], - ['std_5farray_1626',['STD_ARRAY',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba780ad3b04e04029c2b8264dfce2e5f6a',1,'cv::_InputArray']]], - ['std_5farray_5fmat_1627',['STD_ARRAY_MAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba6f2510d5b8467dbd29eed8b1db08ed5f',1,'cv::_InputArray']]], - ['std_5fbool_5fvector_1628',['STD_BOOL_VECTOR',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53bab45e0dc7a61826aa715ff6274ed3f959',1,'cv::_InputArray']]], - ['std_5ffunction_2eh_1629',['std_function.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00524.html',1,'']]], - ['std_5fmutex_2eh_1630',['std_mutex.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00527.html',1,'']]], - ['std_5fvector_1631',['STD_VECTOR',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba967fc6460ab5b965c4a75d722ed37380',1,'cv::_InputArray']]], - ['std_5fvector_5fcuda_5fgpu_5fmat_1632',['STD_VECTOR_CUDA_GPU_MAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba92c94c2700563364fd249037fb0a6ce2',1,'cv::_InputArray']]], - ['std_5fvector_5fmat_1633',['STD_VECTOR_MAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba515a6d0a638e2232a37f16c724eb59e8',1,'cv::_InputArray']]], - ['std_5fvector_5fumat_1634',['STD_VECTOR_UMAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba827a421eedd965d75e051fefe0fa092d',1,'cv::_InputArray']]], - ['std_5fvector_5fvector_1635',['STD_VECTOR_VECTOR',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba21a9a638579ea97800bac55c8d8bb52e',1,'cv::_InputArray']]], - ['stdc_2b_2b_2eh_1636',['stdc++.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00719.html',1,'']]], - ['stddev_1637',['stddev',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a43aa93573bdffbacfde869b5a11bed31',1,'normal_distribution< double >::stddev()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a43aa93573bdffbacfde869b5a11bed31',1,'normal_distribution< result_type >::stddev()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a43aa93573bdffbacfde869b5a11bed31',1,'std::normal_distribution::stddev()']]], - ['stdev_1638',['stdev',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1videostab_1_1GaussianMotionFilter.html#ac4150e7d3b37cdb95442e2a633941cb7',1,'cv::videostab::GaussianMotionFilter']]], - ['stdevthresh_1639',['stdevThresh',['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1videostab_1_1ConsistentMosaicInpainter.html#acaf556d32a5248757702bd662fa8d901',1,'cv::videostab::ConsistentMosaicInpainter']]], - ['stdexcept_1640',['stdexcept',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00146.html',1,'']]], - ['stdio_5ffilebuf_1641',['stdio_filebuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html',1,'__gnu_cxx::stdio_filebuf< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#a8b64983961c6d4f32b5021a79ad39447',1,'__gnu_cxx::stdio_filebuf::stdio_filebuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#a777faeb6849444b4663d1cbe543e1ae3',1,'__gnu_cxx::stdio_filebuf::stdio_filebuf(int __fd, std::ios_base::openmode __mode, size_t __size=static_cast< size_t >(BUFSIZ))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#a197c58345703b4c82256fe5c1574273f',1,'__gnu_cxx::stdio_filebuf::stdio_filebuf(std::__c_file *__f, std::ios_base::openmode __mode, size_t __size=static_cast< size_t >(BUFSIZ))']]], - ['stdio_5ffilebuf_2eh_1642',['stdio_filebuf.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01085.html',1,'']]], - ['stdio_5fsync_5ffilebuf_1643',['stdio_sync_filebuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10671.html',1,'__gnu_cxx']]], - ['stdio_5fsync_5ffilebuf_2eh_1644',['stdio_sync_filebuf.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01088.html',1,'']]], - ['stdlib_2eh_1645',['stdlib.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00014.html',1,'']]], - ['stdn_1646',['stdn',['../namespaceutil.html#a1b6af13be4df99a79372afcde0448fe4',1,'util']]], - ['stdtr1c_2b_2b_2eh_1647',['stdtr1c++.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00722.html',1,'']]], - ['steady_5fclock_1648',['steady_clock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01915.html',1,'std::chrono::_V2']]], - ['step_1649',['step',['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#ae913de2a7d43776977be4ed78d0d9765',1,'cv::cudev::GlobPtr::step'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#af46427ea4c9b3fe7687e3afa84baede3',1,'cv::cuda::GpuMat::step'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a7a34062e40db102086a987edc7f5858c',1,'cv::cuda::HostMem::step'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#ad01672bb85b10aff6f89dfcd93b618f5',1,'cv::LineIterator::step'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ab4b0843e64328eb2a026b5b9ede726fe',1,'cv::Mat::step'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a2678296b48502f641189b7300613b230',1,'cv::gapi::own::detail::MatHeader::step'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a96ee14c5d1163cbb90a111539ea40a49',1,'cv::UMat::step'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#aa91e7e76c9247f7192ab70d0c0be4783',1,'cv::_InputArray::step()']]], - ['step1_1650',['step1',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a5ead91d096cca20e59ba9af8574187cc',1,'cv::cuda::GpuMat::step1()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ad6ab81d95b0e52444250b136e0da3cfd',1,'cv::cudev::GpuMat_::step1()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ab51be367c23f9976389efd3eccbded97',1,'cv::cuda::HostMem::step1()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a0066c8eee40c1706395b1e57f00e0857',1,'cv::Mat::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'cv::Mat_::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< double >::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< float >::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< uchar >::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< unsigned char >::step1()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a5bcb8141a5651e69ceeabddf18d8ddfb',1,'cv::UMat::step1()']]], - ['stept_1651',['stepT',['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a1d9a9d12ecf2297a3d540a1985d6f53a',1,'cv::cudev::GpuMat_::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'cv::Mat_::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< double >::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< float >::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< uchar >::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< unsigned char >::stepT()']]], - ['stereo_1652',['Quasi dense Stereo',['https://docs.opencv.org/4.2.0/d7/d5a/tutorial_qds_quasi_dense_stereo.html',1,'']]], - ['stereo_20correspondance_20algorithms_1653',['Stereo Correspondance Algorithms',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html',1,'']]], - ['stereo_20correspondence_1654',['Stereo Correspondence',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html',1,'']]], - ['stereo_20images_1655',['Depth Map from Stereo Images',['https://docs.opencv.org/4.2.0/dd/d53/tutorial_py_depthmap.html',1,'']]], - ['stereo_20matching_1656',['Multiview Stereo Matching',['https://docs.opencv.org/4.2.0/d7/dd5/group__datasets__msm.html',1,'']]], - ['stereo_20module_1657',['Quasi Dense Stereo (stereo module)',['https://docs.opencv.org/4.2.0/d9/d58/tutorial_table_of_content_quasi_dense_stereo.html',1,'']]], - ['stereo_20stereo_20module_1658',['Quasi Dense Stereo (stereo module)',['https://docs.opencv.org/4.2.0/d9/d58/tutorial_table_of_content_quasi_dense_stereo.html',1,'']]], - ['stereo_2ehpp_1659',['stereo.hpp',['https://docs.opencv.org/4.2.0/de/da3/stereo_2stereo_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d24/stereo_8hpp.html',1,'(Global Namespace)']]], - ['stereobeliefpropagation_1660',['StereoBeliefPropagation',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html',1,'cv::cuda']]], - ['stereobinarybm_1661',['StereoBinaryBM',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html',1,'cv::stereo']]], - ['stereobinarysgbm_1662',['StereoBinarySGBM',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html',1,'cv::stereo']]], - ['stereobm_1663',['StereoBM',['https://docs.opencv.org/4.2.0/db/d8a/classcv_1_1cuda_1_1StereoBM.html',1,'cv::cuda::StereoBM'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html',1,'cv::StereoBM']]], - ['stereocalibrate_1664',['stereoCalibrate',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga91018d80e2a93ade37539f01e6f07de5',1,'cv::stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, InputOutputArray R, InputOutputArray T, OutputArray E, OutputArray F, OutputArray perViewErrors, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga246253dcc6de2e0376c599e7d692303a',1,'cv::stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, OutputArray R, OutputArray T, OutputArray E, OutputArray F, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gadbb3a6ca6429528ef302c784df47949b',1,'cv::fisheye::stereoCalibrate()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga6f1aa828b02e7263394acb5f6821cc84',1,'cv::omnidir::stereoCalibrate()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga91018d80e2a93ade37539f01e6f07de5',1,'stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, InputOutputArray R, InputOutputArray T, OutputArray E, OutputArray F, OutputArray perViewErrors, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga246253dcc6de2e0376c599e7d692303a',1,'stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, OutputArray R, OutputArray T, OutputArray E, OutputArray F, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gadbb3a6ca6429528ef302c784df47949b',1,'stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray K1, InputOutputArray D1, InputOutputArray K2, InputOutputArray D2, Size imageSize, OutputArray R, OutputArray T, int flags=fisheye::CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 100, DBL_EPSILON))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga6f1aa828b02e7263394acb5f6821cc84',1,'stereoCalibrate(InputOutputArrayOfArrays objectPoints, InputOutputArrayOfArrays imagePoints1, InputOutputArrayOfArrays imagePoints2, const Size &imageSize1, const Size &imageSize2, InputOutputArray K1, InputOutputArray xi1, InputOutputArray D1, InputOutputArray K2, InputOutputArray xi2, InputOutputArray D2, OutputArray rvec, OutputArray tvec, OutputArrayOfArrays rvecsL, OutputArrayOfArrays tvecsL, int flags, TermCriteria criteria, OutputArray idx=noArray())(Global Namespace)']]], - ['stereoconstantspacebp_1665',['StereoConstantSpaceBP',['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1cuda_1_1StereoConstantSpaceBP.html',1,'cv::cuda']]], - ['stereographicprojector_1666',['StereographicProjector',['https://docs.opencv.org/4.2.0/d0/ddf/structcv_1_1detail_1_1StereographicProjector.html',1,'cv::detail']]], - ['stereographicwarper_1667',['StereographicWarper',['https://docs.opencv.org/4.2.0/d1/d3d/classcv_1_1detail_1_1StereographicWarper.html',1,'cv::detail::StereographicWarper'],['https://docs.opencv.org/4.2.0/d2/d5e/classcv_1_1StereographicWarper.html',1,'cv::StereographicWarper'],['https://docs.opencv.org/4.2.0/d1/d3d/classcv_1_1detail_1_1StereographicWarper.html#ac2af47f4b063b6c3d11c8ec0e54c5787',1,'cv::detail::StereographicWarper::StereographicWarper()']]], - ['stereomatcher_1668',['StereoMatcher',['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html',1,'cv::stereo::StereoMatcher'],['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html',1,'cv::StereoMatcher']]], - ['stereoreconstruct_1669',['stereoReconstruct',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga907c0cb0b0ec8896f1e60510b546e63a',1,'cv::omnidir::stereoReconstruct()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga907c0cb0b0ec8896f1e60510b546e63a',1,'stereoReconstruct()(Global Namespace)']]], - ['stereorectify_1670',['stereoRectify',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga617b1685d4059c6040827800e72ad2b6',1,'cv::stereoRectify()'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gac1af58774006689056b0f2ef1db55ecc',1,'cv::fisheye::stereoRectify()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gaf055863d589cb166c23cc26fcaa6ce98',1,'cv::omnidir::stereoRectify()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga617b1685d4059c6040827800e72ad2b6',1,'stereoRectify(InputArray cameraMatrix1, InputArray distCoeffs1, InputArray cameraMatrix2, InputArray distCoeffs2, Size imageSize, InputArray R, InputArray T, OutputArray R1, OutputArray R2, OutputArray P1, OutputArray P2, OutputArray Q, int flags=CALIB_ZERO_DISPARITY, double alpha=-1, Size newImageSize=Size(), Rect *validPixROI1=0, Rect *validPixROI2=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gac1af58774006689056b0f2ef1db55ecc',1,'stereoRectify(InputArray K1, InputArray D1, InputArray K2, InputArray D2, const Size &imageSize, InputArray R, InputArray tvec, OutputArray R1, OutputArray R2, OutputArray P1, OutputArray P2, OutputArray Q, int flags, const Size &newImageSize=Size(), double balance=0.0, double fov_scale=1.0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gaf055863d589cb166c23cc26fcaa6ce98',1,'stereoRectify(InputArray R, InputArray T, OutputArray R1, OutputArray R2)(Global Namespace)']]], - ['stereorectifyuncalibrated_1671',['stereoRectifyUncalibrated',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaadc5b14471ddc004939471339294f052',1,'cv::stereoRectifyUncalibrated()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaadc5b14471ddc004939471339294f052',1,'stereoRectifyUncalibrated()(Global Namespace)']]], - ['stereosgbm_1672',['StereoSGBM',['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html',1,'cv']]], - ['sticky_5fbit_1673',['sticky_bit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a3a3b94501085ac7f29f89b8335e886d7',1,'sticky_bit(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a3a3b94501085ac7f29f89b8335e886d7',1,'sticky_bit(Global Namespace)']]], - ['stillimageoutput_1674',['stillImageOutput',['https://docs.opencv.org/4.2.0/d4/d1d/interfaceCvPhotoCamera.html#ad27c86e27dfe3fc626fe9a1bda9e0c73',1,'CvPhotoCamera']]], - ['stitch_1675',['stitch',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a37ee5bacf229e9d0fb9f97c8f5ed1acd',1,'cv::Stitcher::stitch(InputArrayOfArrays images, OutputArray pano)'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a3156a44286a7065ba9e8802023ad2074',1,'cv::Stitcher::stitch(InputArrayOfArrays images, InputArrayOfArrays masks, OutputArray pano)']]], - ['stitcher_1676',['Stitcher',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html',1,'cv']]], - ['stitcher_20class_1677',['High level stitching API (Stitcher class)',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'']]], - ['stitcher_2emarkdown_1678',['stitcher.markdown',['https://docs.opencv.org/4.2.0/dd/d7e/stitcher_8markdown.html',1,'']]], - ['stitching_1679',['Images stitching',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html',1,'']]], - ['stitching_20api_20stitcher_20class_1680',['High level stitching API (Stitcher class)',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'']]], - ['stitching_20stitching_20module_1681',['Images stitching (stitching module)',['https://docs.opencv.org/4.2.0/d0/d33/tutorial_table_of_content_stitching.html',1,'']]], - ['stitching_2ehpp_1682',['stitching.hpp',['https://docs.opencv.org/4.2.0/dc/d7a/stitching_8hpp.html',1,'']]], - ['stitchingloglevel_1683',['stitchingLogLevel',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga7616573f03568a19c14e3333f104b2af',1,'cv::detail::stitchingLogLevel()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga7616573f03568a19c14e3333f104b2af',1,'stitchingLogLevel()(Global Namespace)']]], - ['stl_20containers_20with_20eigen_1684',['Using STL Containers with Eigen',['https://eigen.tuxfamily.org/dox/group__TopicStlContainers.html',1,'']]], - ['stl_20iterators_20and_20algorithms_1685',['STL iterators and algorithms',['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'']]], - ['stl_5falgo_2eh_1686',['stl_algo.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00530.html',1,'']]], - ['stl_5falgobase_2eh_1687',['stl_algobase.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00533.html',1,'']]], - ['stl_5fbvector_2eh_1688',['stl_bvector.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00536.html',1,'']]], - ['stl_5fconstruct_2eh_1689',['stl_construct.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00539.html',1,'']]], - ['stl_5fdeque_2eh_1690',['stl_deque.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00542.html',1,'']]], - ['stl_5ffunction_2eh_1691',['stl_function.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00545.html',1,'']]], - ['stl_5fheap_2eh_1692',['stl_heap.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00548.html',1,'']]], - ['stl_5fiterator_5fbase_5ffuncs_2eh_1693',['stl_iterator_base_funcs.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00554.html',1,'']]], - ['stl_5fiterator_5fbase_5ftypes_2eh_1694',['stl_iterator_base_types.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00557.html',1,'']]], - ['stl_5flist_2eh_1695',['stl_list.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00560.html',1,'']]], - ['stl_5fmap_2eh_1696',['stl_map.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00563.html',1,'']]], - ['stl_5fmultimap_2eh_1697',['stl_multimap.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00566.html',1,'']]], - ['stl_5fmultiset_2eh_1698',['stl_multiset.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00569.html',1,'']]], - ['stl_5fnumeric_2eh_1699',['stl_numeric.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00572.html',1,'']]], - ['stl_5fpair_2eh_1700',['stl_pair.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00575.html',1,'']]], - ['stl_5fqueue_2eh_1701',['stl_queue.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00578.html',1,'']]], - ['stl_5fraw_5fstorage_5fiter_2eh_1702',['stl_raw_storage_iter.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00581.html',1,'']]], - ['stl_5frelops_2eh_1703',['stl_relops.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00584.html',1,'']]], - ['stl_5fset_2eh_1704',['stl_set.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00587.html',1,'']]], - ['stl_5fstack_2eh_1705',['stl_stack.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00590.html',1,'']]], - ['stl_5ftempbuf_2eh_1706',['stl_tempbuf.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00593.html',1,'']]], - ['stl_5ftree_2eh_1707',['stl_tree.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00596.html',1,'']]], - ['stl_5funinitialized_2eh_1708',['stl_uninitialized.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00599.html',1,'']]], - ['stl_5fvector_2eh_1709',['stl_vector.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00602.html',1,'']]], - ['stop_1710',['stop',['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#a40ac8944e71e457352fa481361a025f2',1,'cv::stereo::MVKernel::stop'],['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ac4061f2d28cf54e48360c8aa06135f38',1,'cv::DetectionBasedTracker::stop()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ae8629e18974fc551af940062ad85a5a7',1,'cv::GStreamingCompiled::stop()'],['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html#aa6dfbdc68373d10e371bd35f92c7adb3',1,'cv::TickMeter::stop()'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#adf6487aa9d91d2282201b197b9bd41d3',1,'cv::ocl::Timer::stop()'],['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html#a7cdd54fa926ecd170ec4e7c215f50592',1,'net::mc::tasks::PowerRepeatTask::stop()'],['../classnet_1_1websocket_1_1SingleClientWSServer.html#ac6eba89635a679c01f7b6891123c1d80',1,'net::websocket::SingleClientWSServer::stop()'],['../classutil_1_1AsyncTask.html#a349580908c4774c5d99159f5be226f95',1,'util::AsyncTask::stop()']]], - ['stopentityanimation_1711',['stopEntityAnimation',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#af64b09bc3720eccdfdeaf13fcc5c8f27',1,'cv::ovis::WindowScene']]], - ['stoploop_1712',['stopLoop',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gad4783dd50a6844a04ac8cb4fe158fdf3',1,'cv::stopLoop()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gad4783dd50a6844a04ac8cb4fe158fdf3',1,'stopLoop()(Global Namespace)']]], - ['storage_20orders_1713',['Storage orders',['https://eigen.tuxfamily.org/dox/group__TopicStorageOrders.html',1,'']]], - ['storageindex_1714',['StorageIndex',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2d1aba3f6c414715d830f760913c7e00',1,'Eigen::DenseBase::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2d1aba3f6c414715d830f760913c7e00',1,'DenseBase< ArrayWrapper< ExpressionType > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2d1aba3f6c414715d830f760913c7e00',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2d1aba3f6c414715d830f760913c7e00',1,'DenseBase< Solve< Decomposition, RhsType > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a0b540ba724726ebe953f8c0df06081ed',1,'Eigen::SparseMatrixBase::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a0b540ba724726ebe953f8c0df06081ed',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a0b540ba724726ebe953f8c0df06081ed',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a0b540ba724726ebe953f8c0df06081ed',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a0b540ba724726ebe953f8c0df06081ed',1,'SparseMatrixBase< Transpose< MatrixType > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a0b540ba724726ebe953f8c0df06081ed',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::StorageIndex']]], - ['storageoptions_1715',['StorageOptions',['https://eigen.tuxfamily.org/dox/group__enums.html#gaacded1a18ae58b0f554751f6cdf9eb13',1,'Eigen::StorageOptions'],['https://eigen.tuxfamily.org/dox/group__enums.html#gaacded1a18ae58b0f554751f6cdf9eb13',1,'StorageOptions(Global Namespace)']]], - ['store_5faligned_1716',['STORE_ALIGNED',['https://docs.opencv.org/4.2.0/d6/d19/namespacecv_1_1hal.html#afe7c2ef8e1924718cfa3a33010834904ab5cb308631f6c97244313f5a4d09d621',1,'cv::hal']]], - ['store_5faligned_5fnocache_1717',['STORE_ALIGNED_NOCACHE',['https://docs.opencv.org/4.2.0/d6/d19/namespacecv_1_1hal.html#afe7c2ef8e1924718cfa3a33010834904a37cb7fb8de75e609d48468004ffdb4d2',1,'cv::hal']]], - ['store_5funaligned_1718',['STORE_UNALIGNED',['https://docs.opencv.org/4.2.0/d6/d19/namespacecv_1_1hal.html#afe7c2ef8e1924718cfa3a33010834904adcb5798a4d3a33e327c29d5bb95c080a',1,'cv::hal']]], - ['stored_5fdata_1719',['stored_data',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11531.html',1,'__gnu_pbds::detail']]], - ['stored_5fdata_3c_20_5ftv_2c_20null_5ftype_20_3e_1720',['stored_data< _Tv, null_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11535.html',1,'__gnu_pbds::detail']]], - ['stored_5fhash_1721',['stored_hash',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11527.html',1,'__gnu_pbds::detail']]], - ['stored_5fvalue_1722',['stored_value',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11523.html',1,'__gnu_pbds::detail']]], - ['storemode_1723',['StoreMode',['https://docs.opencv.org/4.2.0/d6/d19/namespacecv_1_1hal.html#afe7c2ef8e1924718cfa3a33010834904',1,'cv::hal']]], - ['str_1724',['STR',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a3b0470ed27a22c483c56b74d21b41d1e',1,'cv::FileNode']]], - ['str_1725',['str',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a8659c3a93da87fb8de3ca1fdd6c49bc0',1,'match_results< _Bi_iter >::str(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a8659c3a93da87fb8de3ca1fdd6c49bc0',1,'match_results< _Bi_iter >::str(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02471.html#a8402e3c2b036fbd4c696b2ab70b49681',1,'std::basic_istringstream::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02471.html#a4040d59ec2be579cca6a91fb5595553e',1,'std::basic_istringstream::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02475.html#a5fe89030a53e674de2823d9a8cfec39c',1,'std::basic_ostringstream::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02475.html#a1bfbc5ef2c20f06dfbbe8bf046cffa3a',1,'std::basic_ostringstream::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a710ce01324037dd8787cde291a3608e0',1,'std::basic_stringbuf::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a54d0b95ccabadaa97884f3c54f1943d2',1,'std::basic_stringbuf::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02479.html#a36e49da6993836a79290489fab310077',1,'std::basic_stringstream::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02479.html#a84b6a2da124b5f937c3f5dfa12d70957',1,'std::basic_stringstream::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a8659c3a93da87fb8de3ca1fdd6c49bc0',1,'std::match_results::str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#acf17e2826b47f664e97bcf9be35fd9f2',1,'std::sub_match::str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#acf17e2826b47f664e97bcf9be35fd9f2',1,'sub_match< _Bi_iter >::str()']]], - ['stream_1726',['Stream',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html',1,'cv::cuda::Stream'],['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#aa6434e2f5f29bd81406732b39951c246',1,'cv::cuda::Stream::Stream()'],['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a3da3061ab4b0c737fcb092494b54cec8',1,'cv::cuda::Stream::Stream(const Ptr< GpuMat::Allocator > &allocator)']]], - ['stream_5fiterator_2eh_1727',['stream_iterator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00605.html',1,'']]], - ['streamaccessor_1728',['StreamAccessor',['https://docs.opencv.org/4.2.0/d6/df1/structcv_1_1cuda_1_1StreamAccessor.html',1,'cv::cuda::StreamAccessor'],['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a8362b5c9fdffe61e694647684353b090',1,'cv::cuda::Stream::StreamAccessor']]], - ['streambuf_1729',['streambuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00149.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga462cbd2938d4a2e7f0ffac97d2168f95',1,'std::streambuf'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga462cbd2938d4a2e7f0ffac97d2168f95',1,'streambuf(Global Namespace)']]], - ['streambuf_2etcc_1730',['streambuf.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00608.html',1,'']]], - ['streambuf_5fiterator_2eh_1731',['streambuf_iterator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00611.html',1,'']]], - ['streambuf_5ftype_1732',['streambuf_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a1db6612d72b7c65ea1f15b51109a4101',1,'std::istreambuf_iterator::streambuf_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a1db6612d72b7c65ea1f15b51109a4101',1,'std::istreambuf_iterator::streambuf_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ab758ea69e2618c0f53825685999de776',1,'std::ostreambuf_iterator::streambuf_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ab758ea69e2618c0f53825685999de776',1,'std::ostreambuf_iterator::streambuf_type']]], - ['streamcallback_1733',['StreamCallback',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a9a27b645eaf4c8bf8c73dd7125712b13',1,'cv::cuda::Stream']]], - ['streamoff_1734',['streamoff',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a48649c5c32f0251572b366063ee93032',1,'std']]], - ['streampos_1735',['streampos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5894cfd4b461e2d4ed3b38402ff59c89',1,'std']]], - ['streamsize_1736',['streamsize',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a05eef5582eb5de62b76db4916f7adb84',1,'std']]], - ['streamtype_1737',['StreamType',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a172ccaaba996db5201af1c17c04a5fe8',1,'cv']]], - ['strictlylower_1738',['StrictlyLower',['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cda2424988b6fca98be70b595632753ba81',1,'Eigen::StrictlyLower'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cda2424988b6fca98be70b595632753ba81',1,'StrictlyLower(Global Namespace)']]], - ['strictlyupper_1739',['StrictlyUpper',['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cda7b37877e0b9b0df28c9c2b669a633265',1,'Eigen::StrictlyUpper'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cda7b37877e0b9b0df28c9c2b669a633265',1,'StrictlyUpper(Global Namespace)']]], - ['stride_1740',['Stride',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html',1,'Eigen']]], - ['stride_1741',['stride',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html#a2d2b66c46cc35bda716d05ea4a152ac9',1,'cv::dnn::BaseConvolutionLayer::stride'],['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#af3a1ef5113d31a1bb055067a240973e1',1,'cv::dnn::PoolingLayer::stride'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#af82410455b282716daa1c06401596c09',1,'NCVMatrix::stride()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8a9378455753dd979d6424bdff021820',1,'std::gslice::stride()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab9ee3d00a3ef2be02ac5895894b66ee7',1,'std::slice::stride()']]], - ['stride_1742',['Stride',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Eigen::Stride::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Eigen::Stride::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Eigen::Stride::Stride(Index outerStride, Index innerStride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Stride< 0, Value >::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Stride< 0, Value >::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Stride< 0, Value >::Stride(Index outerStride, Index innerStride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Stride(Index outerStride, Index innerStride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Stride< Value, 0 >::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Stride< Value, 0 >::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Stride< Value, 0 >::Stride(Index outerStride, Index innerStride)']]], - ['stride_1743',['stride',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab9ee3d00a3ef2be02ac5895894b66ee7',1,]]], - ['stride_3c_200_2c_20value_20_3e_1744',['Stride< 0, Value >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html',1,'']]], - ['stride_3c_20stridetype_3a_3aouterstrideatcompiletime_2c_20stridetype_3a_3ainnerstrideatcompiletime_20_3e_1745',['Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html',1,'']]], - ['stride_3c_20value_2c_200_20_3e_1746',['Stride< Value, 0 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html',1,'']]], - ['strides_1747',['strides',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html#aa6acaa46d472fe48978fd889cf65da8d',1,'cv::dnn::BaseConvolutionLayer::strides'],['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a3bace2a59639f3f9eb26c83a5a36b8cd',1,'cv::dnn::PoolingLayer::strides']]], - ['string_1748',['string',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00152.html',1,'']]], - ['string_1749',['STRING',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a393e00c4e8eca7203f137e1bcb1835e1',1,'cv::FileNode']]], - ['string_1750',['string',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae7fa61092f596efa610a7f672885f3d6',1,'cv::FileNode::string()'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a07eab82f6c82d606787eee9ad73d2bda.html#a07eab82f6c82d606787eee9ad73d2bda',1,'nlohmann::json_sax::string()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01516.html#gaa5dbcd13c2fb305025ac6784482d05a5',1,'std::string'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01516.html#gaa5dbcd13c2fb305025ac6784482d05a5',1,'string(Global Namespace)']]], - ['string_1751',['STRING',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa63b588d5559f64f89a416e656880b949',1,'STRING(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa63b588d5559f64f89a416e656880b949',1,'STRING(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa63b588d5559f64f89a416e656880b949',1,'STRING(Global Namespace)']]], - ['string_1752',['String',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1f6634802eeadfd7245bc75cf3e216c2',1,'cv::String'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1f6634802eeadfd7245bc75cf3e216c2',1,'String(Global Namespace)']]], - ['string_5fconversions_2eh_1753',['string_conversions.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01091.html',1,'']]], - ['string_5ft_1754',['string_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a33593865ffb1860323dcbd52425b90c8.html#a33593865ffb1860323dcbd52425b90c8',1,'nlohmann::basic_json::string_t'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_ae01977a9f3c5b3667b7a2929ed91061e.html#ae01977a9f3c5b3667b7a2929ed91061e',1,'nlohmann::json_sax::string_t']]], - ['string_5ftag_1755',['string_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11215.html',1,'__gnu_pbds']]], - ['string_5ftype_1756',['string_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#af10a9e48b7d0c07aa42e5931d644703f',1,'std::collate::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#af10a9e48b7d0c07aa42e5931d644703f',1,'std::collate::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05899.html#aad3f32937222680b3f47919cdf752b6c',1,'std::collate_byname::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05899.html#aad3f32937222680b3f47919cdf752b6c',1,'std::collate_byname::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#afa0148775189d8fd6ae25409e6c7e880',1,'std::messages::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#afa0148775189d8fd6ae25409e6c7e880',1,'std::messages::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a11e3d55aad9f3e1ce9dfe1514426a441',1,'std::money_get::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a11e3d55aad9f3e1ce9dfe1514426a441',1,'std::money_get::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a34db9f1fec0c7e67646aa4e718e250cd',1,'std::money_put::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a34db9f1fec0c7e67646aa4e718e250cd',1,'std::money_put::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a44855102e480a46ab50cbec6cba6ef1a',1,'std::moneypunct::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a44855102e480a46ab50cbec6cba6ef1a',1,'std::moneypunct::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a12e88768d524b9673b122e1a7665abc2',1,'std::numpunct::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a12e88768d524b9673b122e1a7665abc2',1,'std::numpunct::string_type']]], - ['string_5fview_1757',['string_view',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01022.html',1,'']]], - ['stringbuf_1758',['stringbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gad23290abd940b2cf3fa4e5f53669894e',1,'std::stringbuf'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gad23290abd940b2cf3fa4e5f53669894e',1,'stringbuf(Global Namespace)']]], - ['stringfwd_2eh_1759',['stringfwd.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00617.html',1,'']]], - ['strings_1760',['Strings',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01516.html',1,'']]], - ['strings_20with_20freetype_20harfbuzz_1761',['Drawing UTF-8 strings with freetype/harfbuzz',['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html',1,'']]], - ['stringstream_1762',['stringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga3be8e48d91a15a13829c028b195aad70',1,'std::stringstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga3be8e48d91a15a13829c028b195aad70',1,'stringstream(Global Namespace)']]], - ['strip_1763',['strip',['https://docs.opencv.org/4.2.0/d3/d44/classcv_1_1GArray.html#a77da79851e07739edb1d3b869b485a1a',1,'cv::GArray::strip()'],['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#aa3e0fd33a9587046335f9eb87e399f67',1,'cv::detail::strip()']]], - ['strip_5ftype_1764',['strip_type',['https://docs.opencv.org/4.2.0/da/d1b/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GArray_3_01T_01_4_01_4.html#acdb454d1c6a7b3529ca54a5094034d51',1,'cv::detail::GTypeTraits< cv::GArray< T > >']]], - ['strong_5faffinity_5fthr_1765',['strong_affinity_thr',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a0b4e988bc97ea0060dbd955f2ec11361',1,'cv::tbm::TrackerParams']]], - ['strong_5fthreshold_1766',['strong_threshold',['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#aac6fe117f76f42650f0cf8b02d5aed19',1,'cv::linemod::ColorGradient']]], - ['strongclassifierdirectselection_1767',['StrongClassifierDirectSelection',['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html',1,'cv::StrongClassifierDirectSelection'],['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html#afc508b47e213b9a068c535a6da8d935b',1,'cv::StrongClassifierDirectSelection::StrongClassifierDirectSelection()']]], - ['strstream_1768',['strstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00746.html',1,'']]], - ['structural_20analysis_20and_20shape_20descriptors_1769',['Structural Analysis and Shape Descriptors',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'']]], - ['structure_20from_20motion_1770',['Structure From Motion',['https://docs.opencv.org/4.2.0/d8/d8c/group__sfm.html',1,'Structure From Motion'],['https://docs.opencv.org/4.2.0/de/d7c/tutorial_table_of_content_sfm.html',1,'Structure From Motion']]], - ['structure_20tensor_1771',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], - ['structure_20type_1772',['Data Structure Type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01539.html',1,'']]], - ['structured_20forest_20training_1773',['Structured forest training',['https://docs.opencv.org/4.2.0/d2/d59/tutorial_ximgproc_training.html',1,'']]], - ['structured_20forests_20for_20fast_20edge_20detection_1774',['Structured forests for fast edge detection',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html',1,'Structured forests for fast edge detection'],['https://docs.opencv.org/4.2.0/d0/da5/tutorial_ximgproc_prediction.html',1,'Structured forests for fast edge detection']]], - ['structured_20light_20api_1775',['Structured Light API',['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html',1,'']]], - ['structured_20light_20tutorials_1776',['Structured Light tutorials',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_structured_light.html',1,'']]], - ['structured_5fedge_5fdetection_2ehpp_1777',['structured_edge_detection.hpp',['https://docs.opencv.org/4.2.0/d2/df5/structured__edge__detection_8hpp.html',1,'']]], - ['structured_5flight_2ehpp_1778',['structured_light.hpp',['https://docs.opencv.org/4.2.0/df/d33/structured__light_2structured__light_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d23/structured__light_8hpp.html',1,'(Global Namespace)']]], - ['structured_5flight_2emarkdown_1779',['structured_light.markdown',['https://docs.opencv.org/4.2.0/d9/d3e/structured__light_8markdown.html',1,'']]], - ['structurededgedetection_1780',['StructuredEdgeDetection',['https://docs.opencv.org/4.2.0/d8/d54/classcv_1_1ximgproc_1_1StructuredEdgeDetection.html',1,'cv::ximgproc']]], - ['structuredlightpattern_1781',['StructuredLightPattern',['https://docs.opencv.org/4.2.0/d9/dbb/classcv_1_1structured__light_1_1StructuredLightPattern.html',1,'cv::structured_light']]], - ['structures_1782',['Basic structures',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html',1,'']]], - ['structures_1783',['Structures',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html',1,'Data Structures'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01536.html',1,'Policy-Based Data Structures'],['https://docs.opencv.org/4.2.0/d5/df1/tutorial_js_some_data_structures.html',1,'Some Data Structures']]], - ['structures_20and_20operations_1784',['C structures and operations',['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'']]], - ['structures_20having_20eigen_20members_1785',['Structures Having Eigen Members',['https://eigen.tuxfamily.org/dox/group__TopicStructHavingEigenMembers.html',1,'']]], - ['stsassert_1786',['StsAssert',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaaad9981b6501b20252ca09e719fd260e3',1,'cv::Error']]], - ['stsautotrace_1787',['StsAutoTrace',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa123b92bc9c5061fc5ee3c83063ae96b0',1,'cv::Error']]], - ['stsbacktrace_1788',['StsBackTrace',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaad6c1f3c096dc99e1337e325b98b3248a',1,'cv::Error']]], - ['stsbadarg_1789',['StsBadArg',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaaf587497af64537041ee62c04a92b755d',1,'cv::Error']]], - ['stsbadflag_1790',['StsBadFlag',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaabaf8225a48e1263fa91ff31ae38742e1',1,'cv::Error']]], - ['stsbadfunc_1791',['StsBadFunc',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaaf607ce2a27ae969358b4f68ee0c235b4',1,'cv::Error']]], - ['stsbadmask_1792',['StsBadMask',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa5797e3819fb65dca51b9a1154585801c',1,'cv::Error']]], - ['stsbadmemblock_1793',['StsBadMemBlock',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa4c25fd80ffbf300c1cd65a00ab9549b9',1,'cv::Error']]], - ['stsbadpoint_1794',['StsBadPoint',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaaa7c6b67d606e324e64af6d8985262f5e',1,'cv::Error']]], - ['stsbadsize_1795',['StsBadSize',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa1f4e9ad819c291555c6b5ae42e45e86a',1,'cv::Error']]], - ['stsdivbyzero_1796',['StsDivByZero',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa7d22eccfb697c85312bc99ba5370c8d4',1,'cv::Error']]], - ['stserror_1797',['StsError',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaacf93e97abba2e7defa74fe5b99e122ac',1,'cv::Error']]], - ['stsfilteroffseterr_1798',['StsFilterOffsetErr',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa4f2340a0c03c1f55a5d2c40b3451d8a5',1,'cv::Error']]], - ['stsfilterstructcontenterr_1799',['StsFilterStructContentErr',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa5359a20eee5a4850c267cf9f30a116f8',1,'cv::Error']]], - ['stsinplacenotsupported_1800',['StsInplaceNotSupported',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa1f6b9d48182da888af489a651754e558',1,'cv::Error']]], - ['stsinternal_1801',['StsInternal',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaab3e6a206e16ca696761f9cb52ddd9e1d',1,'cv::Error']]], - ['stskernelstructcontenterr_1802',['StsKernelStructContentErr',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa365707f9d2d6fe1d470e9d5b88795bf4',1,'cv::Error']]], - ['stsnoconv_1803',['StsNoConv',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa7b0d3c58f05aaf8e1b7ffc71a6c972f0',1,'cv::Error']]], - ['stsnomem_1804',['StsNoMem',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa27734f018d2dd51cbaa7e3723cfbf43b',1,'cv::Error']]], - ['stsnotimplemented_1805',['StsNotImplemented',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaab5d0063314f64d350a93d091b542d465',1,'cv::Error']]], - ['stsnullptr_1806',['StsNullPtr',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaad7b48332aa1bee326ee0ca3f3f70cb20',1,'cv::Error']]], - ['stsobjectnotfound_1807',['StsObjectNotFound',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaadea8da9c644db9b7984920ba4576d068',1,'cv::Error']]], - ['stsok_1808',['StsOk',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaabaee502ffca14f1b599157f7b2630cef',1,'cv::Error']]], - ['stsoutofrange_1809',['StsOutOfRange',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaae81e61d2aacc2b4355293af68aededd0',1,'cv::Error']]], - ['stsparseerror_1810',['StsParseError',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa916bf0cb589f4ae1b5da5af8a444bd69',1,'cv::Error']]], - ['stsunmatchedformats_1811',['StsUnmatchedFormats',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa13775beec4927a023c6c219ad29aa160',1,'cv::Error']]], - ['stsunmatchedsizes_1812',['StsUnmatchedSizes',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa5fb735c19fa95cab412642fd8085d82e',1,'cv::Error']]], - ['stsunsupportedformat_1813',['StsUnsupportedFormat',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa33999ba3bd3e78ac3f1b615782a103d2',1,'cv::Error']]], - ['stsveclengtherr_1814',['StsVecLengthErr',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa4860313ddd694922075df8e524e3f4bb',1,'cv::Error']]], - ['student_5ft_5fdistribution_1815',['student_t_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html',1,'std']]], - ['studio_1816',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['studio_20debugger_1817',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['style_20guide_1818',['Style Guide',['../md_StyleGuide.html',1,'']]], - ['style_20rules_1819',['Style Rules',['../md_StyleGuide.html#autotoc_md1',1,'']]], - ['stylization_1820',['stylization',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#gacb0f7324017df153d7b5d095aed53206',1,'cv::stylization()'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#gacb0f7324017df153d7b5d095aed53206',1,'stylization()(Global Namespace)']]], - ['stype_1821',['sType',['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1datasets_1_1PD__inriaObj.html#a2c75d7b8905e53e89d80cac873ebb654',1,'cv::datasets::PD_inriaObj']]], - ['sub_1822',['sub',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gab2a1ac8bdeda1de78ec97f9cd8e9ff0a',1,'cv::gapi::sub()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gab2a1ac8bdeda1de78ec97f9cd8e9ff0a',1,'sub()(Global Namespace)']]], - ['sub16s_1823',['sub16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2168b6368851e50c8c6e5c1b39af2abb',1,'cv::hal::sub16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2168b6368851e50c8c6e5c1b39af2abb',1,'sub16s()(Global Namespace)']]], - ['sub16u_1824',['sub16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38881a1fc619c13b879d08947a4f9038',1,'cv::hal::sub16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38881a1fc619c13b879d08947a4f9038',1,'sub16u()(Global Namespace)']]], - ['sub32f_1825',['sub32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7db1a88cf2010a1a413c8d83d46c8373',1,'cv::hal::sub32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7db1a88cf2010a1a413c8d83d46c8373',1,'sub32f()(Global Namespace)']]], - ['sub32s_1826',['sub32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gad6a86901a206d2c9dd37d693f05eece5',1,'cv::hal::sub32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gad6a86901a206d2c9dd37d693f05eece5',1,'sub32s()(Global Namespace)']]], - ['sub64f_1827',['sub64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabcefa88a20f298b67912d253ed180a5b',1,'cv::hal::sub64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabcefa88a20f298b67912d253ed180a5b',1,'sub64f()(Global Namespace)']]], - ['sub8s_1828',['sub8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a0c3f4922f9b2097b585085eae353dd',1,'cv::hal::sub8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a0c3f4922f9b2097b585085eae353dd',1,'sub8s()(Global Namespace)']]], - ['sub8u_1829',['sub8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66404cf0bb4d0b827efad2c86f0b9139',1,'cv::hal::sub8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66404cf0bb4d0b827efad2c86f0b9139',1,'sub8u()(Global Namespace)']]], - ['sub_5fmatch_1830',['sub_match',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html',1,'std']]], - ['sub_5fmatch_3c_20_5fbi_5fiter_20_3e_1831',['sub_match< _Bi_iter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html',1,'']]], - ['subc_1832',['subC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa5979f64bab17bf1717f2842d6c1d53f',1,'cv::gapi::subC()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa5979f64bab17bf1717f2842d6c1d53f',1,'subC()(Global Namespace)']]], - ['subdiagonal_1833',['subDiagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#ac423dbb91157c159bdcb4b5a8371232e',1,'Eigen::Tridiagonalization']]], - ['subdiv2d_1834',['Subdiv2D',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html',1,'cv::Subdiv2D'],['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aed58be264a17cdbe712b6a35036d13cb',1,'cv::Subdiv2D::Subdiv2D()'],['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa9ae8faa2f7a78428b115407bfc3df9e',1,'cv::Subdiv2D::Subdiv2D(Rect rect)']]], - ['subdivision_1835',['Planar Subdivision',['https://docs.opencv.org/4.2.0/df/d5b/group__imgproc__subdiv2d.html',1,'']]], - ['submatrix_1836',['subMatrix',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a892830aff7387b7fa15298250403c95a',1,'cv::omnidir::internal']]], - ['submatrix_5fflag_1837',['SUBMATRIX_FLAG',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ac0da3ccbc32a8894fc03afb9cea40150a1db725f4a7efd16a41581b4fc54e7aad',1,'cv::Mat::SUBMATRIX_FLAG'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#abf9262de727fd7542c5bead234fc41cea1dadb89fba042bf2b7fb5bca8399aa73',1,'cv::UMat::SUBMATRIX_FLAG']]], - ['subpixels_1838',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], - ['subrc_1839',['subRC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga755bf791d27f88ab5b4214575bf4c5a8',1,'cv::gapi::subRC()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga755bf791d27f88ab5b4214575bf4c5a8',1,'subRC()(Global Namespace)']]], - ['subsetofs_1840',['subsetOfs',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#afd2ee09de243483ccbbd9bd5a0676f2f',1,'cv::ml::DTrees::Split']]], - ['subspaceproject_1841',['subspaceProject',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a69c7019a344edc5c55799c16a9fc9ada',1,'cv::LDA']]], - ['subspacereconstruct_1842',['subspaceReconstruct',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#acbf9949e7567e23af5f71c29fcef76d4',1,'cv::LDA']]], - ['substitute_1843',['substitute',['https://docs.opencv.org/4.2.0/dd/db9/structcv_1_1GTransform.html#a65db27befeb10beae9cd452d04bcc589',1,'cv::GTransform']]], - ['substr_1844',['substr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab38b3bdb3cf4f19355202b28b8424997',1,'__gnu_cxx::__versa_string::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< _CharT >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< _CharT, _Traits, _Allocator >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< char >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< char, char_traits< char >, _Byte_alloc >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< char_type, _Traits, _Alloc >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< value_type >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'std::basic_string::substr()']]], - ['subtract_1845',['subtract',['https://docs.opencv.org/4.2.0/d8/d6f/group__core__hal__interface__addsub.html',1,'Element-wise add and subtract'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#adf3a27e2d042073f2d765522c3f2c870',1,'cv::MatOp::subtract(const MatExpr &expr1, const MatExpr &expr2, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a29ace3bec7c07ca07a159c4c6f058ef1',1,'cv::MatOp::subtract(const Scalar &s, const MatExpr &expr, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa0f00d98b4b5edeaeb7b8333b2de353b',1,'cv::subtract()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga6eab60fc250059e2fda79c5636bd067f',1,'cv::cuda::subtract()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa0f00d98b4b5edeaeb7b8333b2de353b',1,'subtract(InputArray src1, InputArray src2, OutputArray dst, InputArray mask=noArray(), int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga6eab60fc250059e2fda79c5636bd067f',1,'subtract(InputArray src1, InputArray src2, OutputArray dst, InputArray mask=noArray(), int dtype=-1, Stream &stream=Stream::Null())(Global Namespace)']]], - ['subtract_5fwith_5fcarry_5fengine_1846',['subtract_with_carry_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html',1,'std::subtract_with_carry_engine< _UIntType, __w, __s, __r >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a61f08bb272f27b8cbba12a25aee3c804',1,'std::subtract_with_carry_engine::subtract_with_carry_engine(result_type __sd)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#aeb01e590a5c84d08db8b5678ca774172',1,'std::subtract_with_carry_engine::subtract_with_carry_engine(_Sseq &__q)']]], - ['subtraction_1847',['Subtraction',['https://docs.opencv.org/4.2.0/db/d5c/tutorial_py_bg_subtraction.html',1,'Background Subtraction'],['https://docs.opencv.org/4.2.0/de/df4/tutorial_js_bg_subtraction.html',1,'Background Subtraction'],['https://docs.opencv.org/4.2.0/d8/d38/tutorial_bgsegm_bg_subtraction.html',1,'Background Subtraction']]], - ['subtraction_20methods_1848',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], - ['subtractive_5frng_1849',['subtractive_rng',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html',1,'__gnu_cxx::subtractive_rng'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html#a4e0180804e5e548805eca04c560571d5',1,'__gnu_cxx::subtractive_rng::subtractive_rng(unsigned int __seed)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html#a8763d20bcd47a2f9acd2da92e39193a8',1,'__gnu_cxx::subtractive_rng::subtractive_rng()']]], - ['subtype_1850',['subtype',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_ac3ca9d09e55342f9588404e1dc2222f0.html#ac3ca9d09e55342f9588404e1dc2222f0',1,'nlohmann::byte_container_with_subtype']]], - ['success_1851',['Success',['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea671a2aeb0f527802806a441d58a80fcf',1,'Eigen::Success'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea671a2aeb0f527802806a441d58a80fcf',1,'Success(Global Namespace)']]], - ['suffix_1852',['suffix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aae76fe76fdc4f6f729e0a55c8c2d4aa4',1,'match_results< _Bi_iter >::suffix() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aae76fe76fdc4f6f729e0a55c8c2d4aa4',1,'match_results< _Bi_iter >::suffix() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aae76fe76fdc4f6f729e0a55c8c2d4aa4',1,'std::match_results::suffix()']]], - ['suitesparseqr_20module_1853',['SuiteSparseQR module',['https://eigen.tuxfamily.org/dox/group__SPQRSupport__Module.html',1,'']]], - ['sum_1854',['Element-wise weighted sum',['https://docs.opencv.org/4.2.0/da/d9b/group__core__hal__interface__addWeighted.html',1,'']]], - ['sum_1855',['Sum',['https://docs.opencv.org/4.2.0/d8/d60/structcv_1_1cudev_1_1Sum.html',1,'cv::cudev']]], - ['sum_1856',['sum',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a20b718d8c899611ced3cb29b56258495',1,'cv::CvHaarEvaluator::sum'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#a4cb38f0d72fa738431dffea83763ec37',1,'cv::CvLBPEvaluator::sum'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#ab0c4f9ec72059246c2abfc72c47d5ef0',1,'cv::cuda::SURF_CUDA::sum'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabf296b8981ebb3c123b3ba99e753598f',1,'std::valarray::sum()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabf296b8981ebb3c123b3ba99e753598f',1,'valarray< size_t >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'Eigen::DenseBase::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'DenseBase< ArrayWrapper< ExpressionType > >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'DenseBase< Solve< Decomposition, RhsType > >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'Eigen::SparseMatrix::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar, ColMajor, int >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#af48da9cac4c4d8d06d712f7ca4c81ed9',1,'Eigen::SparseVector::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'Eigen::VectorwiseOp::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Derived, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Derived, Vertical >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::sum()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga716e10a2dd9e228e4d3c95818f106722',1,'cv::sum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga1f582844670199281e8012733b50c582',1,'cv::cuda::sum()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga58d80f9e109fed142b280d673afb795a',1,'cv::gapi::sum()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga716e10a2dd9e228e4d3c95818f106722',1,'sum(InputArray src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga58d80f9e109fed142b280d673afb795a',1,'sum(const GMat &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga1f582844670199281e8012733b50c582',1,'sum(InputArray src, InputArray mask=noArray())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabf296b8981ebb3c123b3ba99e753598f',1,'sum() const(Global Namespace)']]], - ['sum_5f_1857',['sum_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa34154947ab224684ddd1020f9e2fb3c',1,'cv::cudev::sum_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa34154947ab224684ddd1020f9e2fb3c',1,'sum_()(Global Namespace)']]], - ['sum_5ftype_1858',['sum_type',['https://docs.opencv.org/4.2.0/d5/d9e/structcv_1_1V__TypeTraits_3_01double_01_4.html#ae1dcc2903a4fd1b127483d0652c7972d',1,'cv::V_TypeTraits< double >::sum_type'],['https://docs.opencv.org/4.2.0/da/d19/structcv_1_1V__TypeTraits_3_01float_01_4.html#addf6559c1c6f35b3d2d1bf41d62276f0',1,'cv::V_TypeTraits< float >::sum_type'],['https://docs.opencv.org/4.2.0/db/d59/structcv_1_1V__TypeTraits_3_01int64_01_4.html#aaefd05cc8c592f9f06324390f3869d67',1,'cv::V_TypeTraits< int64 >::sum_type'],['https://docs.opencv.org/4.2.0/d0/d9d/structcv_1_1V__TypeTraits_3_01schar_01_4.html#ac218f9ffd228d81f349c86ce4b2d5e06',1,'cv::V_TypeTraits< schar >::sum_type'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1V__TypeTraits_3_01short_01_4.html#ad050b1696b786c8fde99df97845d9cdc',1,'cv::V_TypeTraits< short >::sum_type'],['https://docs.opencv.org/4.2.0/dd/d1d/structcv_1_1V__TypeTraits_3_01uchar_01_4.html#a89d20546254941564a05f5f39212ba38',1,'cv::V_TypeTraits< uchar >::sum_type'],['https://docs.opencv.org/4.2.0/d2/d4d/structcv_1_1V__TypeTraits_3_01uint64_01_4.html#a97cf206cf177db63c3a773c9f1a715f1',1,'cv::V_TypeTraits< uint64 >::sum_type'],['https://docs.opencv.org/4.2.0/d3/d8c/structcv_1_1V__TypeTraits_3_01unsigned_01_4.html#a7770eff9c29998b97d2728791ff47d63',1,'cv::V_TypeTraits< unsigned >::sum_type'],['https://docs.opencv.org/4.2.0/d6/dd5/structcv_1_1V__TypeTraits_3_01ushort_01_4.html#a206f0b4adab67410212fe9322bf2e583',1,'cv::V_TypeTraits< ushort >::sum_type']]], - ['sumexprbody_1859',['SumExprBody',['https://docs.opencv.org/4.2.0/dd/d33/structcv_1_1cudev_1_1SumExprBody.html',1,'cv::cudev']]], - ['sungetc_1860',['sungetc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'__gnu_cxx::enc_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'__gnu_cxx::stdio_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'__gnu_cxx::stdio_sync_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_filebuf< char_type, traits_type >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_streambuf< _Elem, _Tr >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_streambuf< char, _Traits >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_streambuf< char, char_traits< char > >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::basic_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::basic_streambuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::basic_stringbuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::wbuffer_convert::sungetc()']]], - ['super_20resolution_1861',['DNN used for super resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'']]], - ['super_20resolution_1862',['Super Resolution',['https://docs.opencv.org/4.2.0/d1/d5b/group__datasets__sr.html',1,'Super Resolution'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html',1,'Super Resolution']]], - ['super_20resolution_20benchmarking_1863',['Super-resolution benchmarking',['https://docs.opencv.org/4.2.0/dc/d69/tutorial_dnn_superres_benchmark.html',1,'']]], - ['super_20resolution_20using_20cnns_1864',['Super Resolution using CNNs',['https://docs.opencv.org/4.2.0/d8/df8/tutorial_table_of_content_dnn_superres.html',1,'']]], - ['superilu_1865',['SuperILU',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperILU.html',1,'Eigen']]], - ['superlu_1866',['SuperLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLU.html',1,'Eigen']]], - ['superlubase_1867',['SuperLUBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html',1,'Eigen']]], - ['superlubase_3c_20_5fmatrixtype_2c_20superilu_3c_20_5fmatrixtype_20_3e_20_3e_1868',['SuperLUBase< _MatrixType, SuperILU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html',1,'']]], - ['superlubase_3c_20_5fmatrixtype_2c_20superlu_3c_20_5fmatrixtype_20_3e_20_3e_1869',['SuperLUBase< _MatrixType, SuperLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html',1,'']]], - ['superlusupport_20module_1870',['SuperLUSupport module',['https://eigen.tuxfamily.org/dox/group__SuperLUSupport__Module.html',1,'']]], - ['superpixellsc_1871',['SuperpixelLSC',['https://docs.opencv.org/4.2.0/d5/da0/classcv_1_1ximgproc_1_1SuperpixelLSC.html',1,'cv::ximgproc']]], - ['superpixels_1872',['Superpixels',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html',1,'']]], - ['superpixelseeds_1873',['SuperpixelSEEDS',['https://docs.opencv.org/4.2.0/df/d81/classcv_1_1ximgproc_1_1SuperpixelSEEDS.html',1,'cv::ximgproc']]], - ['superpixelslic_1874',['SuperpixelSLIC',['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1ximgproc_1_1SuperpixelSLIC.html',1,'cv::ximgproc']]], - ['superres_2ehpp_1875',['superres.hpp',['https://docs.opencv.org/4.2.0/d8/d2a/superres_8hpp.html',1,'']]], - ['superresolution_1876',['SuperResolution',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html',1,'cv::superres::SuperResolution'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a6b6da407515d5def4552cf513ae9e98a',1,'cv::superres::SuperResolution::SuperResolution()']]], - ['support_1877',['support',['https://docs.opencv.org/4.2.0/dc/db1/tutorial_dnn_custom_layers.html',1,'Custom deep learning layers support'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html',1,'Eigen support'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html',1,'Legacy support'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html',1,'Math with F0-transform support'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html',1,'Math with F1-transform support'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html',1,'OpenCL support'],['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html',1,'OpenGL support'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html',1,'Softfloat support'],['https://docs.opencv.org/4.2.0/d6/d2f/group__highgui__winrt.html',1,'WinRT support']]], - ['support_20modules_1878',['Support modules',['https://eigen.tuxfamily.org/dox/group__Support__modules.html',1,'']]], - ['support_20vector_20machines_1879',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], - ['support_20vector_20machines_20for_20non_20linearly_20separable_20data_1880',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], - ['support_20vector_20machines_20svm_1881',['Support Vector Machines (SVM)',['https://docs.opencv.org/4.2.0/d3/d02/tutorial_py_svm_index.html',1,'']]], - ['supportbackend_1882',['supportBackend',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a14017804fd5e8c28807263bbdb415383',1,'cv::dnn::Layer']]], - ['supportregiontype_1883',['supportRegionType',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a203bd482fc0efa091faf0e537768d5d1',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['supportregiontype_1884',['SupportRegionType',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gabd57af723cddf921d0c0601a6e8e789b',1,'cv::optflow::SupportRegionType'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gabd57af723cddf921d0c0601a6e8e789b',1,'SupportRegionType(Global Namespace)']]], - ['supports_1885',['supports',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a67e89f47a61b1bb016e3b20f644f762e',1,'cv::cuda::DeviceInfo']]], - ['suppress_1886',['suppress',['https://docs.opencv.org/4.2.0/d8/da1/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressor.html#aa829e4bb7e33b11567ec3f040e28a7fc',1,'cv::videostab::MoreAccurateMotionWobbleSuppressor::suppress()'],['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1videostab_1_1NullWobbleSuppressor.html#a73bca4742402ffcc348a9acbfc52d07b',1,'cv::videostab::NullWobbleSuppressor::suppress()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a1c39fa83a31e7c62d80b029b8cc19e80',1,'cv::videostab::WobbleSuppressorBase::suppress()']]], - ['suppress_5funused_5fwarning_1887',['suppress_unused_warning',['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a5f00f5a230b8dc4f63bdd1c8057ace44',1,'cv::util']]], - ['suppressedframe_5f_1888',['suppressedFrame_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a203f58bdb554c66e152401327219beb4',1,'cv::videostab::TwoPassStabilizer']]], - ['surf_1889',['SURF',['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html',1,'cv::xfeatures2d']]], - ['surf_20speeded_20up_20robust_20features_1890',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], - ['surf_5fcuda_1891',['SURF_CUDA',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html',1,'cv::cuda::SURF_CUDA'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#ac6522a440dea4b95807d3a3b3417e6a0',1,'cv::cuda::SURF_CUDA::SURF_CUDA()'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a0f7077b5561a105841be6f1a46a29b6d',1,'cv::cuda::SURF_CUDA::SURF_CUDA(double _hessianThreshold, int _nOctaves=4, int _nOctaveLayers=2, bool _extended=false, float _keypointsRatio=0.01f, bool _upright=false)']]], - ['surface_20matching_1892',['Surface Matching',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html',1,'']]], - ['surface_5fmatching_2ehpp_1893',['surface_matching.hpp',['https://docs.opencv.org/4.2.0/d2/d40/surface__matching_8hpp.html',1,'']]], - ['surfacealignment_1894',['surfaceAlignment',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a125e3c0cbd8c63d07637863dff8b0608',1,'cv::cuda::DeviceInfo']]], - ['surfaceformat_1895',['SurfaceFormat',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gaaac1ece32d7b3efa9afc9811315d35cb',1,'cv::cudacodec::SurfaceFormat'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gaaac1ece32d7b3efa9afc9811315d35cb',1,'SurfaceFormat(Global Namespace)']]], - ['surfdescriptorextractor_1896',['SurfDescriptorExtractor',['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#ga4a54d552fe0a5b05a00d1b49c7b5340c',1,'cv::xfeatures2d::SurfDescriptorExtractor'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#ga4a54d552fe0a5b05a00d1b49c7b5340c',1,'SurfDescriptorExtractor(Global Namespace)']]], - ['surffeaturedetector_1897',['SurfFeatureDetector',['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#ga6af725cc4317bde8fe1176b04fe93d41',1,'cv::xfeatures2d::SurfFeatureDetector'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#ga6af725cc4317bde8fe1176b04fe93d41',1,'SurfFeatureDetector(Global Namespace)']]], - ['svbacksubst_1898',['SVBackSubst',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab4e620e6fc6c8a27bb2be3d50a840c0b',1,'cv::SVBackSubst()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab4e620e6fc6c8a27bb2be3d50a840c0b',1,'SVBackSubst()(Global Namespace)']]], - ['svd_1899',['SVD',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html',1,'cv::SVD'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a3830f50d56ac2ff7b979e6f7f8991e36',1,'cv::SVD::SVD()'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a54cb96aef54978a3617cb2a2169b689a',1,'cv::SVD::SVD(InputArray src, int flags=0)']]], - ['svd_20module_1900',['SVD module',['https://eigen.tuxfamily.org/dox/group__SVD__Module.html',1,'']]], - ['svd32f_1901',['SVD32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7e379c106c1228dcdac27bab1fb81c6e',1,'cv::hal::SVD32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7e379c106c1228dcdac27bab1fb81c6e',1,'SVD32f()(Global Namespace)']]], - ['svd64f_1902',['SVD64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae50420ada479a479075a154a9e7fb642',1,'cv::hal::SVD64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae50420ada479a479075a154a9e7fb642',1,'SVD64f()(Global Namespace)']]], - ['svdbase_1903',['SVDBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html',1,'Eigen::SVDBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#abed06fc6f4b743e1f76a7b317539da87',1,'Eigen::SVDBase::SVDBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#abed06fc6f4b743e1f76a7b317539da87',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::SVDBase()']]], - ['svdbase_3c_20jacobisvd_3c_20_5fmatrixtype_2c_20qrpreconditioner_20_3e_20_3e_1904',['SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html',1,'']]], - ['svdecomp_1905',['SVDecomp',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab477b5b7b39b370bb03e75b19d2d5109',1,'cv::SVDecomp()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab477b5b7b39b370bb03e75b19d2d5109',1,'SVDecomp(InputArray src, OutputArray w, OutputArray u, OutputArray vt, int flags=0)(Global Namespace)']]], - ['svm_1906',['SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'OCR of Hand-written Data using SVM'],['https://docs.opencv.org/4.2.0/d3/d02/tutorial_py_svm_index.html',1,'Support Vector Machines (SVM)'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html',1,'cv::ml::SVM'],['https://docs.opencv.org/4.2.0/d4/db1/tutorial_py_svm_basics.html',1,'Understanding SVM']]], - ['svmdetector_1907',['svmDetector',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a904130d56281ba264e097e9895c648f5',1,'cv::HOGDescriptor']]], - ['svmsgd_1908',['SVMSGD',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html',1,'cv::ml']]], - ['svmsgdtype_1909',['SvmsgdType',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#ab028695cc8ec1491888d8d03f80bc8c2',1,'cv::ml::SVMSGD']]], - ['swap_1910',['swap',['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#aefa0132aaa70b264555656fd48d7a3f5',1,'cv::util::any::swap'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a7135c058aef51c37884a2b2ae8151631',1,'cv::cuda::GpuMat::swap()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a0e1c66de99997b6fe13959dfb6794f2f',1,'cv::cudev::GpuMat_::swap()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a6eabc73d59936b87292125e17415b053',1,'cv::cuda::HostMem::swap()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#ac084b122b402d3c64976e0ccad57ddaf',1,'cv::util::optional::swap()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ac7471fa2590350e45b30cb72da0f7668',1,'cv::util::variant::swap()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ac7471fa2590350e45b30cb72da0f7668',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a05eed1a275b62f425fe4843edb708956',1,'__gnu_cxx::__versa_string::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'__gnu_debug::basic_string::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11783.html#a3a1a56d0954c344eb4db26dce4b84562',1,'__gnu_pbds::sample_probe_fn::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11787.html#a7a6dee2c024c6c77e605c9814e5979cb',1,'__gnu_pbds::sample_range_hashing::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11791.html#a72bbcd1a06b6196c03a35a880ba6ed72',1,'__gnu_pbds::sample_ranged_hash_fn::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#ae0e145612d3056d7186fffcacce2c85d',1,'__gnu_pbds::sample_resize_policy::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a822549474a8d6f889f3aa0abf99656ce',1,'__gnu_pbds::sample_resize_trigger::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12015.html#a48c1b41db4e557029b119c8c5d6002f8',1,'__gnu_pbds::sample_size_policy::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#ad866a56fdeeed727b04774acdc78ab1e',1,'__gnu_pbds::sample_update_policy::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< _CharT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< _CharT, _Traits, _Allocator >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< char >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< char, char_traits< char >, _Byte_alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< char_type, _Traits, _Alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< value_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a41f78615b6896d0b85bef3aea0e41f2f',1,'deque< _StateSeqT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#afca54335268365fbe964394a8fe5df1b',1,'list< __inp, __rebind_inp >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a104e0215b1b9709a9a3cef3280078ded',1,'match_results< _Bi_iter >::swap(match_results &__that) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'match_results< _Bi_iter >::swap(vector &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a104e0215b1b9709a9a3cef3280078ded',1,'match_results< _Bi_iter >::swap(match_results &__that) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a5cd0631c180f408fe3aa42a384bbaa74',1,'std::basic_regex::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'std::basic_string::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a41f78615b6896d0b85bef3aea0e41f2f',1,'std::deque::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a767521afed6c6768073fdef22d2ed292',1,'std::experimental::fundamentals_v1::any::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a3c41eb7aabcd13c334d38bc68afe2cd8',1,'std::forward_list::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#ad6e98060b15f59120e426a787febf1a5',1,'std::function< _Res(_ArgTypes...)>::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#afca54335268365fbe964394a8fe5df1b',1,'std::list::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a6ab3829e42e61a94d9039fea4c07b62f',1,'std::map::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'std::match_results::swap(vector &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a104e0215b1b9709a9a3cef3280078ded',1,'std::match_results::swap(match_results &__that) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a65f198a3e5054fc993d8519127c7b314',1,'std::multimap::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a42f6bb9c9951b84e1876e29cd3b4b607',1,'std::multiset::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2ad1ef1062ee331c848605434d1d5ef6',1,'std::set::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a2029b19ff5945268a03a130ee05e7e75',1,'std::tr2::dynamic_bitset::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'std::unique_ptr::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a6516afbc423bf1f13c37c3c0324fa0f9',1,'std::unique_ptr< _Tp[], _Dp >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae06bac0d1fbee8603ec2ac806950b1ba',1,'std::unordered_map::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac8d3f27e1315796ddcc9b55378f90ce7',1,'std::unordered_multimap::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a87b28725f19b4afc7e58d052bf07be2f',1,'std::unordered_multiset::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a688f24d7010519e2bfa001db6fe180e7',1,'std::unordered_set::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6033c5c6f21fed896e5ff6a06bba62b9',1,'std::valarray::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'std::vector::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Codecvt >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Res_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Result< _Res > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Result_base >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< bool[]>::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae06bac0d1fbee8603ec2ac806950b1ba',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6033c5c6f21fed896e5ff6a06bba62b9',1,'valarray< size_t >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< __diff_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _CharClassT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _CharT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _Cmpt >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _Node *, _Nodeptr_Alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _RealType >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _State< _TraitsT::char_type > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _StringT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< block_type, allocator_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< Catalog_info * >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< double >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< int >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< result_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< size_t >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< std::pair< _BiIter, int > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< std::pair< _StateIdT, std::vector > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< std::pair< _StrTransT, _StrTransT > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< sub_match< _Bi_iter >, _Alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< sub_match< _BiIter >, _Alloc >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'Eigen::DenseBase::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'Eigen::DenseBase::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'DenseBase< ArrayWrapper< ExpressionType > >::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'DenseBase< ArrayWrapper< ExpressionType > >::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'DenseBase< Solve< Decomposition, RhsType > >::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'DenseBase< Solve< Decomposition, RhsType > >::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'Eigen::SparseMatrix::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar, ColMajor, int >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#af0902c911efcf6f162022175b3efd12b',1,'Eigen::SparseVector::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a0c1ece2f97341c7c7e698d67343421a5',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::swap(MatrixBase< OtherDerived > const &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a4e16e0824796bfa218cc91da98fe05b1',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::swap(TriangularBase< OtherDerived > &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aee0ae36cbfb0336832ebc0374c3c7679.html#aee0ae36cbfb0336832ebc0374c3c7679',1,'nlohmann::basic_json::swap'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a94295a06e0e7b3867fe83afbee4cb202.html#a94295a06e0e7b3867fe83afbee4cb202',1,'nlohmann::basic_json::swap(reference other) noexcept(std::is_nothrow_move_constructible< value_t >::value &&std::is_nothrow_move_assignable< value_t >::value &&std::is_nothrow_move_constructible< json_value >::value &&std::is_nothrow_move_assignable< json_value >::value)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a76126242de262f6d38cadda19e0d13e1.html#a76126242de262f6d38cadda19e0d13e1',1,'nlohmann::basic_json::swap(array_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a57b86bdcfc55557dacc36969adb0417e.html#a57b86bdcfc55557dacc36969adb0417e',1,'nlohmann::basic_json::swap(object_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aac916df9561daf4eaf2372119fe91899.html#aac916df9561daf4eaf2372119fe91899',1,'nlohmann::basic_json::swap(string_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa242e339ebc7583e114f2167a83f8c90.html#aa242e339ebc7583e114f2167a83f8c90',1,'nlohmann::basic_json::swap(binary_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a749a1f5091a5e63ccfe919e0aef986af.html#a749a1f5091a5e63ccfe919e0aef986af',1,'nlohmann::basic_json::swap(typename binary_t::container_type &other)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gafbc8f513f40dc1b7c2d48ea6a5a81776',1,'cv::swap(Mat &a, Mat &b)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaac41913cb7239fd2771b3c3f25349fe0',1,'cv::swap(UMat &a, UMat &b)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gafbc8f513f40dc1b7c2d48ea6a5a81776',1,'swap(Mat &a, Mat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaac41913cb7239fd2771b3c3f25349fe0',1,'swap(UMat &a, UMat &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ac29506dd75ee99d6a88ade595233c6f8',1,'__gnu_cxx::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9d75305041fc556b922d4b3bd2667742',1,'std::swap(pair< _T1, _T2 > &__x, pair< _T1, _T2 > &__y) noexcept(noexcept(__x.swap(__y)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4d5a9efe4608a61cb6c74ddda7f8728f',1,'std::swap(function< _Res(_Args...)> &__x, function< _Res(_Args...)> &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga8cdf0d24423573721c4bdb9b2ffd8a7d',1,'std::swap(basic_regex< _Ch_type, _Rx_traits > &__lhs, basic_regex< _Ch_type, _Rx_traits > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a87939e8186f838ff337074e945c78b6d',1,'std::swap(basic_stringbuf< _CharT, _Traits, _Allocator > &__x, basic_stringbuf< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4dedd893b6faf3eb2e6c6aa0ca0f2e32',1,'std::swap(basic_istringstream< _CharT, _Traits, _Allocator > &__x, basic_istringstream< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab7f8e65ad7deb2a81c9178499d71731a',1,'std::swap(basic_ostringstream< _CharT, _Traits, _Allocator > &__x, basic_ostringstream< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a85a913837de066af6c23b0f4f28e02a0',1,'std::swap(basic_stringstream< _CharT, _Traits, _Allocator > &__x, basic_stringstream< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4007a6b034645ec64b2d436df27a03ec',1,'std::swap(multiset< _Key, _Compare, _Alloc > &__x, multiset< _Key, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9bbb29387dfd4bfad2ef30fb555f649a',1,'std::swap(set< _Key, _Compare, _Alloc > &__x, set< _Key, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae448a7aacea236579e3f239c9448482f',1,'std::swap(multimap< _Key, _Tp, _Compare, _Alloc > &__x, multimap< _Key, _Tp, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab99dc85cd3551cb410655b02a56e5c15',1,'std::swap(basic_filebuf< _CharT, _Traits > &__x, basic_filebuf< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acfe891185fde2307f6e8909338c7b862',1,'std::swap(basic_ifstream< _CharT, _Traits > &__x, basic_ifstream< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4965e732ce5d02e4304dd82bc86e365a',1,'std::swap(basic_ofstream< _CharT, _Traits > &__x, basic_ofstream< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7ccd229f5faee26395b8ee1715576cf0',1,'std::swap(basic_fstream< _CharT, _Traits > &__x, basic_fstream< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aeb866eb47db586b6058b597e97d8b909',1,'std::swap(forward_list< _Tp, _Alloc > &__lx, forward_list< _Tp, _Alloc > &__ly) noexcept(noexcept(__lx.swap(__ly)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a520781978c7299c8f0e206542178d09c',1,'std::swap(map< _Key, _Tp, _Compare, _Alloc > &__x, map< _Key, _Tp, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga2700089f8b9371e6aafdb9a7e7a552e7',1,'std::swap(packaged_task< _Res(_ArgTypes...)> &__x, packaged_task< _Res(_ArgTypes...)> &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga77f74f34f378f6d6b5b987ab9a684c2d',1,'std::swap(tuple< _Elements... > &__x, tuple< _Elements... > &__y) noexcept(noexcept(__x.swap(__y)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a89a3a6f9c11a9ade523d0be6e5b3a190',1,'std::swap(vector< _Tp, _Alloc > &__x, vector< _Tp, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e4c5e4d115e26e6d2e4adf552d9a90',1,'std::swap(match_results< _Bi_iter, _Alloc > &__lhs, match_results< _Bi_iter, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a335bd8d8bfd13a75e2e5c34552ec3daf',1,'std::swap(list< _Tp, _Alloc > &__x, list< _Tp, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7e6765b86dfe7f33455aec5b8a7f7e2e',1,'std::swap(deque< _Tp, _Alloc > &__x, deque< _Tp, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gafa6fdf3b3bd0b4a333f150d62001e9fc',1,'std::swap(_Tp &__a, _Tp &__b) noexcept(__and_< is_nothrow_move_constructible< _Tp >, is_nothrow_move_assignable< _Tp > >::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga6b5d2a0f9529c41034917992630c6c85',1,'std::swap(_Tp(&__a)[_Nm], _Tp(&__b)[_Nm]) noexcept(__is_nothrow_swappable< _Tp >::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0be9c6cc80dd454ea2212c47538c61c4',1,'std::swap(basic_string< _CharT, _Traits, _Alloc > &__lhs, basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac58580a65df691769770684cc985719d',1,'std::swap(unique_lock< _Mutex > &__x, unique_lock< _Mutex > &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga0d3de8f7ff80877e53d25ca9057e1c0f',1,'std::swap(shared_lock< _Mutex > &__x, shared_lock< _Mutex > &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a9f4d5ac9d6926c4a0e2d97179887cb6c',1,'std::__debug::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a416f44c6d2ed7e920c8bab2362ce8ffb',1,'std::__profile::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga2700089f8b9371e6aafdb9a7e7a552e7',1,'swap(packaged_task< _Res(_ArgTypes...)> &__x, packaged_task< _Res(_ArgTypes...)> &__y) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga0d3de8f7ff80877e53d25ca9057e1c0f',1,'swap(shared_lock< _Mutex > &__x, shared_lock< _Mutex > &__y) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6033c5c6f21fed896e5ff6a06bba62b9',1,'swap(valarray< _Tp > &__v) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga8cdf0d24423573721c4bdb9b2ffd8a7d',1,'swap(basic_regex< _Ch_type, _Rx_traits > &__lhs, basic_regex< _Ch_type, _Rx_traits > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e4c5e4d115e26e6d2e4adf552d9a90',1,'swap(match_results< _Bi_iter, _Alloc > &__lhs, match_results< _Bi_iter, _Alloc > &__rhs) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#ga8007443c4b8291e332ef93b1875440b9',1,'swap(any &__x, any &__y) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9d75305041fc556b922d4b3bd2667742',1,'swap(pair< _T1, _T2 > &__x, pair< _T1, _T2 > &__y) noexcept(noexcept(__x.swap(__y)))(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga77f74f34f378f6d6b5b987ab9a684c2d',1,'swap(tuple< _Elements... > &__x, tuple< _Elements... > &__y) noexcept(noexcept(__x.swap(__y)))(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gafa6fdf3b3bd0b4a333f150d62001e9fc',1,'swap(_Tp &__a, _Tp &__b) noexcept(__and_< is_nothrow_move_constructible< _Tp >, is_nothrow_move_assignable< _Tp > >::value)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga6b5d2a0f9529c41034917992630c6c85',1,'swap(_Tp(&__a)[_Nm], _Tp(&__b)[_Nm]) noexcept(__is_nothrow_swappable< _Tp >::value)(Global Namespace)']]], - ['swap_5franges_1911',['swap_ranges',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gae9603907c05659cb5cfc6ea20be9ae01',1,'std::swap_ranges()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gae9603907c05659cb5cfc6ea20be9ae01',1,'swap_ranges()(Global Namespace)']]], - ['swapchannels_1912',['swapChannels',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga75a29cc4a97cde0d43ea066b01de927e',1,'cv::cuda::swapChannels()'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga75a29cc4a97cde0d43ea066b01de927e',1,'swapChannels()(Global Namespace)']]], - ['swapedges_1913',['swapEdges',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1e1fb5d4dceadb03ac61c678cf1afb7f',1,'cv::Subdiv2D']]], - ['swapendian_1914',['swapEndian',['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html#abe2a117d06ff01ec0ce31782cf2aff52',1,'cv::cnn_3dobj::icoSphere']]], - ['swapfeature_1915',['swapFeature',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a64898258ae7de0da05dc80bc18c29c32',1,'cv::TrackerFeatureHAAR::swapFeature(int source, int target)'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a50d20081386f85b3dabe20caa1d229a8',1,'cv::TrackerFeatureHAAR::swapFeature(int id, CvHaarEvaluator::FeatureHaar &feature)']]], - ['swapping_20using_20face_20landmark_20detection_1916',['Face swapping using face landmark detection',['https://docs.opencv.org/4.2.0/d1/d52/tutorial_face_swapping_face_landmark_detection.html',1,'']]], - ['swervedrivekinematics_1917',['SwerveDriveKinematics',['../classkinematics_1_1SwerveDriveKinematics.html',1,'kinematics::SwerveDriveKinematics'],['../classkinematics_1_1SwerveDriveKinematics.html#aacea45f4e805cb42850ddb1fd7e7533f',1,'kinematics::SwerveDriveKinematics::SwerveDriveKinematics()']]], - ['swervewheelvel_5ft_1918',['swervewheelvel_t',['../structkinematics_1_1swervewheelvel__t.html',1,'kinematics']]], - ['swishlayer_1919',['SwishLayer',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1dnn_1_1SwishLayer.html',1,'cv::dnn']]], - ['switchtoselectivesearchfast_1920',['switchToSelectiveSearchFast',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a4ea50c9a9df83193dc16f9b74bd95805',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], - ['switchtoselectivesearchquality_1921',['switchToSelectiveSearchQuality',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a4824333bbdd5877e14859298a2ecde12',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], - ['switchtosinglestrategy_1922',['switchToSingleStrategy',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a15995e73a7476442dda5b4210e1e177a',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], - ['symbol_1923',['symbol',['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#a45265d0feab99428177831a24374854f',1,'cv::viz::KeyboardEvent']]], - ['symbolexpr_1924',['SymbolExpr',['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolExpr.html',1,'Eigen::symbolic']]], - ['symbolvalue_1925',['SymbolValue',['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolValue.html',1,'Eigen::symbolic::SymbolValue< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolValue.html#a2db2a280f108f3253e4f21858a2d14ca',1,'Eigen::symbolic::SymbolValue::SymbolValue()']]], - ['symedge_1926',['symEdge',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aabbb10b8d5b0311b7e22040fc0db56b4',1,'cv::Subdiv2D']]], - ['symetriccensus_1927',['SymetricCensus',['https://docs.opencv.org/4.2.0/dd/d24/classcv_1_1stereo_1_1SymetricCensus.html',1,'cv::stereo::SymetricCensus< num_images >'],['https://docs.opencv.org/4.2.0/dd/d24/classcv_1_1stereo_1_1SymetricCensus.html#aec7d620a84cd10c722ff58dee97734c4',1,'cv::stereo::SymetricCensus::SymetricCensus()']]], - ['symetriccensustransform_1928',['symetricCensusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a36512a3362c08ac5f26e9c7e7eca1abb',1,'cv::stereo::symetricCensusTransform(const cv::Mat &img1, const cv::Mat &img2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2, const int type)'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a966b36bd327d3da0025d71fa41d361c2',1,'cv::stereo::symetricCensusTransform(const cv::Mat &img1, int kernelSize, cv::Mat &dist1, const int type)']]], - ['symlink_5fnofollow_1929',['symlink_nofollow',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a158f9bd59daefad511af9171cb1ca644',1,'symlink_nofollow(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a158f9bd59daefad511af9171cb1ca644',1,'symlink_nofollow(Global Namespace)']]], - ['symmetric_1930',['Symmetric',['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cdad5381b2d1c8973a08303c94e7da02333',1,'Eigen::Symmetric'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cdad5381b2d1c8973a08303c94e7da02333',1,'Symmetric(Global Namespace)']]], - ['symmetric_5fgrid_1931',['SYMMETRIC_GRID',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#ad83bbd88c4d01f670638e8ef4ffa6240a906cc75c28fca6241be50f284c5defd8',1,'cv::CirclesGridFinderParameters']]], - ['sync_1932',['sync',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'__gnu_cxx::enc_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'__gnu_cxx::stdio_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10671.html#aaf870a6b01d27af87ca27c16e601d1df',1,'__gnu_cxx::stdio_sync_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'basic_filebuf< char_type, traits_type >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_iostream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_iostream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char, _Traits >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char, _Traits >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'basic_streambuf< _Elem, _Tr >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'basic_streambuf< char, _Traits >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'basic_streambuf< char, char_traits< char > >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'std::basic_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_fstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_fstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_ifstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_ifstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_iostream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_iostream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'std::basic_streambuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'std::basic_stringbuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_stringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_stringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05907.html#aba9f090cf1273168ea80a024419dab92',1,'std::wbuffer_convert::sync()']]], - ['sync_5fwith_5fstdio_1933',['sync_with_stdio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_ios< char, _Traits >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_iostream< char >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_istream< char >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_istream< char, _Traits >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_ostream< char >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_ostream< char, _Traits >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_fstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ifstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ios::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_iostream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_istream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_istringstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ofstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ostream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ostringstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_stringstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::ios_base::sync_with_stdio()']]], - ['syntax_5foption_5ftype_1934',['syntax_option_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a510caedb3e640b81620023a85c1280bb',1,'std::regex_constants']]], - ['synth_5faccess_5ftraits_1935',['synth_access_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11955.html',1,'__gnu_pbds::detail::synth_access_traits< Type_Traits, Set, _ATraits >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11959.html#a076ca568f4c7eea0eddeca4690af15c9',1,'__gnu_pbds::detail::trie_traits< Key, Mapped, _ATraits, Node_Update, pat_trie_tag, _Alloc >::synth_access_traits'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11963.html#a2ae24123cf94f809e6baf7cb21b97b3d',1,'__gnu_pbds::detail::trie_traits< Key, null_type, _ATraits, Node_Update, pat_trie_tag, _Alloc >::synth_access_traits']]], - ['synth_5faccess_5ftraits_2ehpp_1936',['synth_access_traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01385.html',1,'']]], - ['syntheticsequencegenerator_1937',['SyntheticSequenceGenerator',['https://docs.opencv.org/4.2.0/d1/dda/classcv_1_1bgsegm_1_1SyntheticSequenceGenerator.html',1,'cv::bgsegm::SyntheticSequenceGenerator'],['https://docs.opencv.org/4.2.0/d1/dda/classcv_1_1bgsegm_1_1SyntheticSequenceGenerator.html#a1252da52b70175c097e304334a0723b6',1,'cv::bgsegm::SyntheticSequenceGenerator::SyntheticSequenceGenerator()']]], - ['system_20functions_20and_20macros_1938',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], - ['system_5fclock_1939',['system_clock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01911.html',1,'std::chrono::_V2']]], - ['system_5ferror_1940',['system_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02855.html',1,'std::system_error'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00155.html',1,'(Global Namespace)']]], - ['systems_1941',['systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'Cross compilation for ARM based Linux systems'],['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'Solving linear least squares systems']]], - ['systems_1942',['Solving Sparse Linear Systems',['https://eigen.tuxfamily.org/dox/group__TopicSparseSystems.html',1,'']]], - ['sz_1943',['sz',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a721c16a853d3bae3f41c8c0e9634b5a3',1,'cv::_InputArray::sz'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a6025c7fd11fa230c2c315673d2d293b3',1,'cv::AutoBuffer::sz'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a6025c7fd11fa230c2c315673d2d293b3',1,'AutoBuffer< double, 1 >::sz'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a6025c7fd11fa230c2c315673d2d293b3',1,'AutoBuffer< int64, 1 >::sz'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a6025c7fd11fa230c2c315673d2d293b3',1,'AutoBuffer< String, 1 >::sz'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a7c4ecb345f1bd57c86f9395c7b82de91',1,'cv::ocl::KernelArg::sz']]] + ['shared_5fptr_3c_20uint32_5ft_20_3e_1106',['shared_ptr< uint32_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20videoinputstream_20_3e_1107',['shared_ptr< VideoInputStream >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_5fatomic_2eh_1108',['shared_ptr_atomic.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00506.html',1,'']]], + ['shared_5fptr_5fbase_2eh_1109',['shared_ptr_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00509.html',1,'']]], + ['shared_5ftimed_5fmutex_1110',['shared_timed_mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02779.html',1,'std']]], + ['sharedmemperblock_1111',['sharedMemPerBlock',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a7b4b9d16c69096eed5c08d2241f23a2f',1,'cv::cuda::DeviceInfo']]], + ['sharpness_1112',['sharpness',['https://docs.opencv.org/4.2.0/d4/d69/classcv_1_1detail_1_1FeatherBlender.html#a52175c9bf5fb8ccbe692dcec2f575320',1,'cv::detail::FeatherBlender']]], + ['shear_1113',['shear',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a00c72ce1fb692fcb8b9903f4ffec4f6c',1,'cv::QtFont::shear'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ae93a25d5e15af9446d7e5bc0e7a959d0',1,'Eigen::Transform::shear()']]], + ['shi_20tomasi_20corner_20detector_1114',['Shi-Tomasi corner detector',['https://docs.opencv.org/4.2.0/d8/dd8/tutorial_good_features_to_track.html',1,'']]], + ['shi_20tomasi_20corner_20detector_20good_20features_20to_20track_1115',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], + ['shift_1116',['SHIFT',['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#aaee8f2a3f0f04415acca5f1ada1ce8edaaabb16b9959c94ef32fe148b8db588ee',1,'cv::viz::KeyboardEvent']]], + ['shift_1117',['shift',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#aa571029c188c8767217f30b1513b2c98',1,'cv::gapi::wip::draw::Circle::shift'],['https://docs.opencv.org/4.2.0/db/db3/structcv_1_1cudev_1_1DefaultTransformPolicy.html#a8c19f9716033eac39284b9f6a525ac16a12c995c60f73304ca07f58848b12f8e6',1,'cv::cudev::DefaultTransformPolicy::shift'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#acc52fba3d21e3f2460d93d6619f74e51',1,'cv::gapi::wip::draw::Line::shift'],['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#a0ebea19a04470282d18b27f228cd47b4',1,'cv::gapi::wip::draw::Poly::shift'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1dnn_1_1PowerLayer.html#a96951cd8316a3dba004888c6a0f949f6',1,'cv::dnn::PowerLayer::shift'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html#af97b87851eadb7784c3723f007b92b0a',1,'cv::gapi::wip::draw::Rect::shift'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaebe5d7bc4dea9740cdbb03d36a3e4521',1,'std::valarray::shift()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaebe5d7bc4dea9740cdbb03d36a3e4521',1,'valarray< size_t >::shift()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaebe5d7bc4dea9740cdbb03d36a3e4521',1,'shift()(Global Namespace)']]], + ['shiftlayer_1118',['ShiftLayer',['https://docs.opencv.org/4.2.0/d3/dd8/classcv_1_1dnn_1_1ShiftLayer.html',1,'cv::dnn']]], + ['shiftmat_1119',['shiftMat',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a9718fe1a611b341eb1063245c9d327e3',1,'cv::AlignMTB']]], + ['shiftvalue_1120',['shiftValue',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#a59e0895b9e37f8af2f9ff659697ae5d0',1,'cv::structured_light::SinusoidalPattern::Params']]], + ['shortdim_1121',['shortdim',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'cv::Matx::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< _Tp, cn, 1 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, 1, 3 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, 2, 2 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, 2, 3 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, 3, 3 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, 3, 4 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, 4, 4 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< double, cn, 1 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< float, 2, 3 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< float, 3, 3 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< float, cn, 1 >::shortdim'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cdae18e575d92a15cffb078249823e5d9ac',1,'Matx< float_type, 4, 4 >::shortdim']]], + ['show_5fimage_2ehpp_1122',['show_image.hpp',['https://docs.opencv.org/4.2.0/df/d91/show__image_8hpp.html',1,'']]], + ['show_5ftrackbar_1123',['SHOW_TRACKBAR',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html#gga5291115322efc2f86c7551ab37ab6554ac59c8b93c4987d5342beea897023e8e8',1,'cv::SHOW_TRACKBAR'],['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html#gga5291115322efc2f86c7551ab37ab6554ac59c8b93c4987d5342beea897023e8e8',1,'SHOW_TRACKBAR(Global Namespace)']]], + ['showbase_1124',['showbase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'basic_ios< char, _Traits >::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'basic_iostream< char >::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'basic_istream< char >::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'basic_istream< char, _Traits >::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'basic_ostream< char >::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'basic_ostream< char, _Traits >::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_fstream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_ifstream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_ios::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_iostream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_istream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_istringstream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_ofstream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_ostream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_ostringstream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::basic_stringstream::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a69acbf246475f065d6648303e452fd4d',1,'std::ios_base::showbase'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5a3653d71579c614748abf4a73bbed92',1,'std::showbase()']]], + ['showimage_1125',['showImage',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a9d5e364f5afd0c80d2c0c71bd24095ec',1,'cv::viz::Viz3d::showImage()'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga776e85265cd41bf22cfd8c5bfff1b045',1,'cvv::showImage(cv::InputArray img, impl::CallMetaData metaData=impl::CallMetaData(), const char *description=nullptr, const char *view=nullptr)'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#gacd3ae9dce4c81f1d7d9bf8fd04d01c60',1,'cvv::showImage(cv::InputArray img, impl::CallMetaData metaData, const ::std::string &description, const ::std::string &view="")'],['https://docs.opencv.org/4.2.0/d7/d84/namespacecvv_1_1impl.html#a5e7f1938e252a7c78ab0fa6751f06808',1,'cvv::impl::showImage()']]], + ['showmanyc_1126',['showmanyc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0e8e4218ba9766e34b74e69b17fb28b3',1,'__gnu_cxx::enc_filebuf::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0e8e4218ba9766e34b74e69b17fb28b3',1,'__gnu_cxx::stdio_filebuf::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a85e9299b4d91188c1c0070111604ece8',1,'__gnu_cxx::stdio_sync_filebuf::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0e8e4218ba9766e34b74e69b17fb28b3',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0e8e4218ba9766e34b74e69b17fb28b3',1,'basic_filebuf< char_type, traits_type >::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a85e9299b4d91188c1c0070111604ece8',1,'basic_streambuf< _Elem, _Tr >::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a85e9299b4d91188c1c0070111604ece8',1,'basic_streambuf< char, _Traits >::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a85e9299b4d91188c1c0070111604ece8',1,'basic_streambuf< char, char_traits< char > >::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a0e8e4218ba9766e34b74e69b17fb28b3',1,'std::basic_filebuf::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a85e9299b4d91188c1c0070111604ece8',1,'std::basic_streambuf::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a24490a3224662a3c57cbb8f591b2acbc',1,'std::basic_stringbuf::showmanyc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a85e9299b4d91188c1c0070111604ece8',1,'std::wbuffer_convert::showmanyc()']]], + ['showpoint_1127',['showpoint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'basic_ios< char, _Traits >::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'basic_iostream< char >::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'basic_istream< char >::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'basic_istream< char, _Traits >::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'basic_ostream< char >::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'basic_ostream< char, _Traits >::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_fstream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_ifstream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_ios::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_iostream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_istream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_istringstream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_ofstream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_ostream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_ostringstream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::basic_stringstream::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a4c79db16d6509208744e2b698a2d107f',1,'std::ios_base::showpoint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0cd05ebd891c06400f5e04a84eb6d539',1,'std::showpoint()']]], + ['showpos_1128',['showpos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'basic_ios< char, _Traits >::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'basic_iostream< char >::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'basic_istream< char >::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'basic_istream< char, _Traits >::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'basic_ostream< char >::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'basic_ostream< char, _Traits >::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_fstream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_ifstream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_ios::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_iostream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_istream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_istringstream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_ofstream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_ostream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_ostringstream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::basic_stringstream::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#acf2cdf1f2ebd7914d39e25c1f071bbc4',1,'std::ios_base::showpos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8eff68e8b5f8d409761a2a6db01924d3',1,'std::showpos()']]], + ['showwidget_1129',['showWidget',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a3fcc945304c6475313fd3b18f1b053fd',1,'cv::viz::Viz3d']]], + ['shrink_5fto_5ffit_1130',['shrink_to_fit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a979da4f0d7e764ee55fbafbce4ea9a3e',1,'__gnu_cxx::__versa_string::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< _CharT >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< _CharT, _Traits, _Allocator >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< char >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< char, char_traits< char >, _Byte_alloc >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< char_type, _Traits, _Alloc >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'basic_string< value_type >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#abe9c2e87fe6d96dbbbf7f50f750d3cf2',1,'deque< _StateSeqT >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'match_results< _Bi_iter >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a74201ef9d14b1fd7c7e116268e277023',1,'std::basic_string::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#abe9c2e87fe6d96dbbbf7f50f750d3cf2',1,'std::deque::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'std::match_results::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'std::vector::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< __diff_type >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _CharClassT >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _CharT >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _Cmpt >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _Node *, _Nodeptr_Alloc >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _RealType >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _State< _TraitsT::char_type > >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< _StringT >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< block_type, allocator_type >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< Catalog_info * >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< double >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< int >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< result_type >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< size_t >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< std::pair< _BiIter, int > >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< std::pair< _StateIdT, std::vector > >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< std::pair< _StrTransT, _StrTransT > >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< sub_match< _Bi_iter >, _Alloc >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::shrink_to_fit()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a4f4dc31fc105124cd9a5e4a90ae99c44',1,'vector< sub_match< _BiIter >, _Alloc >::shrink_to_fit()']]], + ['shrinkcaffemodel_1131',['shrinkCaffeModel',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga5de8769f48b44f631c1767b1700069fa',1,'cv::dnn::shrinkCaffeModel()'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga5de8769f48b44f631c1767b1700069fa',1,'shrinkCaffeModel()(Global Namespace)']]], + ['shrinkptr_1132',['shrinkPtr',['https://docs.opencv.org/4.2.0/df/db4/structcv_1_1cudev_1_1PtrTraits_3_01Expr_3_01Body_01_4_01_4.html#af182552fce54ea04e9f84e1192cfb24f',1,'cv::cudev::PtrTraits< Expr< Body > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'cv::cudev::PtrTraitsBase::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< AffineMapPtrSz, AffineMapPtr >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op >, BinaryTransformPtr< Src1Ptr, Src2Ptr, Op > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< CommonAreaInterPtrSz< SrcPtr >, CommonAreaInterPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< ConstantPtrSz< T >, ConstantPtr< T > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< CubicInterPtrSz< SrcPtr >, CubicInterPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< DerivXPtrSz< SrcPtr >, DerivXPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< DerivYPtrSz< SrcPtr >, DerivYPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< GlobPtrSz< T >, GlobPtr< T > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< GpuMat_< T >, GlobPtr< T > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< IntegerAreaInterPtrSz< SrcPtr >, IntegerAreaInterPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< LaplacianPtrSz< ksize, SrcPtr >, LaplacianPtr< ksize, SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< LinearInterPtrSz< SrcPtr >, LinearInterPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< LutPtrSz< SrcPtr, TablePtr >, LutPtr< SrcPtr, TablePtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< NearestInterPtrSz< SrcPtr >, NearestInterPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< PerspectiveMapPtrSz, PerspectiveMapPtr >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< Ptr2DSz, Ptr2DSz >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< RemapPtr1Sz< SrcPtr, MapPtr >, RemapPtr1< SrcPtr, MapPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr >, RemapPtr2< SrcPtr, MapXPtr, MapYPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< ResizePtrSz< SrcPtr >, ResizePtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< ScharrXPtrSz< SrcPtr >, ScharrXPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< ScharrYPtrSz< SrcPtr >, ScharrYPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< SingleMaskChannelsSz< MaskPtr >, SingleMaskChannels< MaskPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< SobelXPtrSz< SrcPtr >, SobelXPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< SobelYPtrSz< SrcPtr >, SobelYPtr< SrcPtr > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< SrcPtr, SrcPtr >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< Texture< T >, TexturePtr< T > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< UnaryTransformPtrSz< SrcPtr, Op >, UnaryTransformPtr< SrcPtr, Op > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#a17d5c5dba728eeaa99bbc55f697245d4',1,'PtrTraitsBase< ZipPtrSz< PtrTuple >, ZipPtr< PtrTuple > >::shrinkPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc7cb8a993a39e0d2ed85dc0b3599e79',1,'cv::cudev::shrinkPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc7cb8a993a39e0d2ed85dc0b3599e79',1,'shrinkPtr()(Global Namespace)']]], + ['shuffle_1133',['shuffle',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga9c197f83f8612241f91e0a44703fdeaf',1,'std::shuffle()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga9c197f83f8612241f91e0a44703fdeaf',1,'shuffle(_RandomAccessIterator __first, _RandomAccessIterator __last, _UniformRandomNumberGenerator &&__g)(Global Namespace)']]], + ['shuffle_2ehpp_1134',['shuffle.hpp',['https://docs.opencv.org/4.2.0/d1/d77/shuffle_8hpp.html',1,'']]], + ['shuffle_5forder_5fengine_1135',['shuffle_order_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html',1,'std::shuffle_order_engine< _RandomNumberEngine, __k >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a1c37fc430a7cf2349c132c90f0801923',1,'std::shuffle_order_engine::shuffle_order_engine()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a228bba34a29fdf432372dc6f605d0330',1,'std::shuffle_order_engine::shuffle_order_engine(const _RandomNumberEngine &__rng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a4b9cec5ade2194c8ceeffb2681b18699',1,'std::shuffle_order_engine::shuffle_order_engine(_RandomNumberEngine &&__rng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a70fed621d89883c406dc36076bd9729f',1,'std::shuffle_order_engine::shuffle_order_engine(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a281bbe063224c9ba2010c1ecf6e22f6c',1,'std::shuffle_order_engine::shuffle_order_engine(_Sseq &__q)']]], + ['shufflechannellayer_1136',['ShuffleChannelLayer',['https://docs.opencv.org/4.2.0/de/d24/classcv_1_1dnn_1_1ShuffleChannelLayer.html',1,'cv::dnn']]], + ['shuffletraintest_1137',['shuffleTrainTest',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#a0515ddd44168aa5c42478536375c760b',1,'cv::ml::TrainData']]], + ['si_1138',['si',['https://docs.opencv.org/4.2.0/d2/d71/classcv_1_1xfeatures2d_1_1Elliptic__KeyPoint.html#a5d626241e7fed0fc2e7adaeaa252dbda',1,'cv::xfeatures2d::Elliptic_KeyPoint']]], + ['sidetype_1139',['SideType',['https://eigen.tuxfamily.org/dox/group__enums.html#gac22de43beeac7a78b384f99bed5cee0b',1,'Eigen::SideType'],['https://eigen.tuxfamily.org/dox/group__enums.html#gac22de43beeac7a78b384f99bed5cee0b',1,'SideType(Global Namespace)']]], + ['sift_1140',['SIFT',['https://docs.opencv.org/4.2.0/d5/d3c/classcv_1_1xfeatures2d_1_1SIFT.html',1,'cv::xfeatures2d']]], + ['sift_20scale_20invariant_20feature_20transform_1141',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], + ['siftdescriptorextractor_1142',['SiftDescriptorExtractor',['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#ga2d9f078de10b03cf1ebe8102d1826901',1,'cv::xfeatures2d::SiftDescriptorExtractor'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#ga2d9f078de10b03cf1ebe8102d1826901',1,'SiftDescriptorExtractor(Global Namespace)']]], + ['siftfeaturedetector_1143',['SiftFeatureDetector',['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#gace6ee881f1443844fee1091169976208',1,'cv::xfeatures2d::SiftFeatureDetector'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#gace6ee881f1443844fee1091169976208',1,'SiftFeatureDetector(Global Namespace)']]], + ['sigma_1144',['sigma',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a978654926d6b272fa64414912e18f63a',1,'cv::TrackerKCF::Params']]], + ['sigma_5f2_1145',['sigma_2',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a7e5408f273ea4d96d6c3f0d970412d91',1,'cv::quality::QualitySSIM::_mat_data']]], + ['sigma_5fscale_1146',['sigma_scale',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#aaea0230da037d0d3506e08b86dee125f',1,'cv::line_descriptor::LSDParam']]], + ['sigmadepth_1147',['sigmaDepth',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a0f35e7ef9553b5131ab73d1f7a8bc70b',1,'cv::rgbd::FastICPOdometry']]], + ['sigmaspatial_1148',['sigmaSpatial',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a9608ce96dd2e95c19844fc5fd07bca71',1,'cv::rgbd::FastICPOdometry']]], + ['sigmoid_1149',['SIGMOID',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56ac40981025a9b8f3c1cd35cb015aac5cc',1,'cv::ml::SVM']]], + ['sigmoid_1150',['sigmoid',['https://docs.opencv.org/4.2.0/dc/d72/classcv_1_1ClfMilBoost.html#afe98709127d61a7318309087647fdb53',1,'cv::ClfMilBoost']]], + ['sigmoid_5fsym_1151',['SIGMOID_SYM',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ade71470ec8814021728f8b31b09773b0a90410002f1e243d35dca234f859f270e',1,'cv::ml::ANN_MLP']]], + ['sigmoidlayer_1152',['SigmoidLayer',['https://docs.opencv.org/4.2.0/dc/d09/classcv_1_1dnn_1_1SigmoidLayer.html',1,'cv::dnn']]], + ['sign_1153',['sign',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a831e88e0403a42d0dfb328d8acd3e56f',1,'Eigen']]], + ['signal_20processing_1154',['NPPST Signal Processing',['https://docs.opencv.org/4.2.0/de/d25/group__npps.html',1,'']]], + ['signaling_5fnan_1155',['signaling_NaN',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#aeaa1c3844ce0a450c06cc2f81e1cf4eb',1,'std::numeric_limits']]], + ['signdeterminant_1156',['signDeterminant',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a6a8117bd54d5bb0d0d8358c2a00e095e',1,'Eigen::SparseLU']]], + ['signeddistance_1157',['signedDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#abe362349d10c5852b007958c5e1152eb',1,'Eigen::Hyperplane']]], + ['signedgradient_1158',['signedGradient',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a0c2f2db8693dbec32092bc659d25c9b9',1,'cv::HOGDescriptor']]], + ['silver_1159',['silver',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a9c9cd4141fa9474c1fb3e0618dbb9c00',1,'cv::viz::Color']]], + ['sim_5fmotor_1160',['sim_motor',['../classrobot_1_1sim__motor.html',1,'robot::sim_motor'],['../classrobot_1_1sim__motor.html#a7c49622d018ef6e87765232fd7496140',1,'robot::sim_motor::sim_motor()']]], + ['simd_5ffunctions_2ehpp_1161',['simd_functions.hpp',['https://docs.opencv.org/4.2.0/dc/db9/modules_2core_2include_2opencv2_2core_2cuda_2simd__functions_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/db5/contrib_2modules_2cudev_2include_2opencv2_2cudev_2util_2simd__functions_8hpp.html',1,'(Global Namespace)']]], + ['simd_5fintrinsics_2ehpp_1162',['simd_intrinsics.hpp',['https://docs.opencv.org/4.2.0/da/d5b/simd__intrinsics_8hpp.html',1,'']]], + ['similarity_1163',['similarity',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a4da5f6ba2c636df795c478edd4d3bc5a',1,'cv::linemod::Match']]], + ['similarity_20check_20pnsr_20and_20ssim_20on_20the_20gpu_1164',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], + ['similarity_20measurement_1165',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], + ['similarityfunction_1166',['SimilarityFunction',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#ac72268153bf12925f601c4defe7d5e50',1,'cv::xfeatures2d::PCTSignatures']]], + ['similarrects_1167',['SimilarRects',['https://docs.opencv.org/4.2.0/d1/d65/classcv_1_1SimilarRects.html',1,'cv::SimilarRects'],['https://docs.opencv.org/4.2.0/d1/d65/classcv_1_1SimilarRects.html#a547aec6ba82d071bd660637060c8a777',1,'cv::SimilarRects::SimilarRects()']]], + ['simple_20example_1168',['What happens inside Eigen, on a simple example',['https://eigen.tuxfamily.org/dox/TopicInsideEigenExample.html',1,'']]], + ['simple_20pipeline_1169',['Simple Pipeline',['https://docs.opencv.org/4.2.0/d7/de2/group__simple__pipeline.html',1,'']]], + ['simple_5fpipeline_2ehpp_1170',['simple_pipeline.hpp',['https://docs.opencv.org/4.2.0/de/d65/simple__pipeline_8hpp.html',1,'']]], + ['simpleblobdetector_1171',['SimpleBlobDetector',['https://docs.opencv.org/4.2.0/d0/d7a/classcv_1_1SimpleBlobDetector.html',1,'cv']]], + ['simplewb_1172',['SimpleWB',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html',1,'cv::xphoto']]], + ['simplex_5fdownhill_2eh_1173',['simplex_downhill.h',['https://docs.opencv.org/4.2.0/dd/df3/simplex__downhill_8h.html',1,'']]], + ['simplicialcholesky_1174',['SimplicialCholesky',['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholesky.html',1,'Eigen']]], + ['simplicialcholeskybase_1175',['SimplicialCholeskyBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html',1,'Eigen::SimplicialCholeskyBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html#a098baba1dbe07ca3a775c8df1f8a0e71',1,'Eigen::SimplicialCholeskyBase::SimplicialCholeskyBase()']]], + ['simplicialldlt_1176',['SimplicialLDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html',1,'Eigen::SimplicialLDLT'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a16eb3402b26cc70f9f24da75f0c74426',1,'Eigen::SimplicialLDLT::SimplicialLDLT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a819d581e3768db316bc51f0f50fd0976',1,'Eigen::SimplicialLDLT::SimplicialLDLT(const MatrixType &matrix)']]], + ['simplicialllt_1177',['SimplicialLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html',1,'Eigen::SimplicialLLT'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#abd9294399538d5a62418cb0b62dc0cec',1,'Eigen::SimplicialLLT::SimplicialLLT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a6df9cc66170620b7f53a4d39e2c8b4f1',1,'Eigen::SimplicialLLT::SimplicialLLT(const MatrixType &matrix)']]], + ['simulatedannealingsolver_1178',['simulatedAnnealingSolver',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ga2b136c7508a37057e01ef2473694714f',1,'cv::ml::simulatedAnnealingSolver()'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ga2b136c7508a37057e01ef2473694714f',1,'simulatedAnnealingSolver()(Global Namespace)']]], + ['simulatedannealingsolversystem_1179',['SimulatedAnnealingSolverSystem',['https://docs.opencv.org/4.2.0/dc/db4/structcv_1_1ml_1_1SimulatedAnnealingSolverSystem.html',1,'cv::ml']]], + ['sin_1180',['sin',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a02f4ff0fcbbae2f3ccaa5981e8ad5e34',1,'Eigen::MatrixBase::sin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a02f4ff0fcbbae2f3ccaa5981e8ad5e34',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a02f4ff0fcbbae2f3ccaa5981e8ad5e34',1,'MatrixBase< Solve< Decomposition, RhsType > >::sin()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad7c879b58f79ccd980f4ce13fe3db49a',1,'cv::sin()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09521d0ba1e338a8709ba2b34191ece0',1,'cv::cudev::sin(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2671b223cd6902850864586638c5ac23',1,'cv::cudev::sin(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f147de79af702d8d4398a75a1521c41',1,'cv::cudev::sin(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa65ebb1958aa6daaacb7e0b94810ff87',1,'cv::cudev::sin(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ca6d7da7566d4fed9d0472b070bda3c',1,'cv::cudev::sin(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40f69179231e1d9aec1e60bf3fd67744',1,'cv::cudev::sin(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb37f9efcdb08d87d26702803205670c',1,'cv::cudev::sin(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga603ead4205bbc200a0f1c7eb2894a3a7',1,'cv::cudev::sin(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d00db800f05fc15be653fd37d4380e4',1,'cv::cudev::sin(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f96ddc1a5114686c3a916de5d4a2dbb',1,'cv::cudev::sin(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9a4525a60ac6b9342aa440db3be7cbc',1,'cv::cudev::sin(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90c83f6fdb6e0cf40a0fd5960e1597cb',1,'cv::cudev::sin(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga915d35b330bdfe06327511373de2cd6f',1,'cv::cudev::sin(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e3378e56015ebf4fee733ffe8546e78',1,'cv::cudev::sin(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d987301b57d2a3e0f6effc19c062290',1,'cv::cudev::sin(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ead77b8219b1623b103970d7d2657b',1,'cv::cudev::sin(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab32dadaf27d00fd3ae420bfe2993b089',1,'cv::cudev::sin(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d5cc3d51b7df55c83dc6338cfc4b272',1,'cv::cudev::sin(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga609b61e646afc5ea47c8da0ed4af188a',1,'cv::cudev::sin(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40a71fd43839f68db29d5d3d9d991fe8',1,'cv::cudev::sin(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cfbafe094337f83a97d0884e8618c9',1,'cv::cudev::sin(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae04f739d259ae154cd26a39b5604f694',1,'cv::cudev::sin(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70aca1b22d401d2de7d7efc3323bca93',1,'cv::cudev::sin(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e004f45ce1d6e29fa3ccaea88d4ee80',1,'cv::cudev::sin(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72e7e4ab7f2f475737f808409ad5e41f',1,'cv::cudev::sin(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18a0f30cd4a933e15d636a5fee642cf7',1,'cv::cudev::sin(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae82be4ae62a43620e9d309c88fc2f96f',1,'cv::cudev::sin(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d64e2eb87abb7ae2364c7ee304014ba',1,'cv::cudev::sin(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc3ae5929000eb7f97153640ed2fe09',1,'cv::cudev::sin(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1841ebd92ea58d1ad61b78b3e7f90829',1,'cv::cudev::sin(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2ccede62049f156c6ddd6db49c438e6',1,'cv::cudev::sin(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2740282849b89e813cb302a1d0444aa',1,'cv::cudev::sin(const double2 &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad7c879b58f79ccd980f4ce13fe3db49a',1,'sin(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09521d0ba1e338a8709ba2b34191ece0',1,'sin(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2671b223cd6902850864586638c5ac23',1,'sin(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f147de79af702d8d4398a75a1521c41',1,'sin(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa65ebb1958aa6daaacb7e0b94810ff87',1,'sin(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ca6d7da7566d4fed9d0472b070bda3c',1,'sin(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40f69179231e1d9aec1e60bf3fd67744',1,'sin(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb37f9efcdb08d87d26702803205670c',1,'sin(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga603ead4205bbc200a0f1c7eb2894a3a7',1,'sin(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d00db800f05fc15be653fd37d4380e4',1,'sin(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f96ddc1a5114686c3a916de5d4a2dbb',1,'sin(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9a4525a60ac6b9342aa440db3be7cbc',1,'sin(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90c83f6fdb6e0cf40a0fd5960e1597cb',1,'sin(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga915d35b330bdfe06327511373de2cd6f',1,'sin(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e3378e56015ebf4fee733ffe8546e78',1,'sin(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d987301b57d2a3e0f6effc19c062290',1,'sin(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ead77b8219b1623b103970d7d2657b',1,'sin(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab32dadaf27d00fd3ae420bfe2993b089',1,'sin(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d5cc3d51b7df55c83dc6338cfc4b272',1,'sin(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga609b61e646afc5ea47c8da0ed4af188a',1,'sin(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40a71fd43839f68db29d5d3d9d991fe8',1,'sin(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cfbafe094337f83a97d0884e8618c9',1,'sin(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae04f739d259ae154cd26a39b5604f694',1,'sin(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70aca1b22d401d2de7d7efc3323bca93',1,'sin(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e004f45ce1d6e29fa3ccaea88d4ee80',1,'sin(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72e7e4ab7f2f475737f808409ad5e41f',1,'sin(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18a0f30cd4a933e15d636a5fee642cf7',1,'sin(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae82be4ae62a43620e9d309c88fc2f96f',1,'sin(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d64e2eb87abb7ae2364c7ee304014ba',1,'sin(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc3ae5929000eb7f97153640ed2fe09',1,'sin(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1841ebd92ea58d1ad61b78b3e7f90829',1,'sin(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2ccede62049f156c6ddd6db49c438e6',1,'sin(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2740282849b89e813cb302a1d0444aa',1,'sin(const double2 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga249915bcbce6563e63f5ffa6d464155a',1,'std::sin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga249915bcbce6563e63f5ffa6d464155a',1,'sin()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae6e8ad270ff41c088d7651567594f796',1,'Eigen::sin()']]], + ['sin_5f_1181',['sin_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b2f2547ca8e9c510526423826cdc3d6',1,'cv::cudev::sin_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b2f2547ca8e9c510526423826cdc3d6',1,'sin_()(Global Namespace)']]], + ['sin_5ffunc_1182',['sin_func',['https://docs.opencv.org/4.2.0/d1/d05/structcv_1_1cudev_1_1sin__func.html',1,'cv::cudev']]], + ['sin_5ffunc_3c_20double_20_3e_1183',['sin_func< double >',['https://docs.opencv.org/4.2.0/d8/d1c/structcv_1_1cudev_1_1sin__func_3_01double_01_4.html',1,'cv::cudev']]], + ['sin_5ffunc_3c_20float_20_3e_1184',['sin_func< float >',['https://docs.opencv.org/4.2.0/d6/d2b/structcv_1_1cudev_1_1sin__func_3_01float_01_4.html',1,'cv::cudev']]], + ['sin_5ffunc_3c_20schar_20_3e_1185',['sin_func< schar >',['https://docs.opencv.org/4.2.0/d8/d1b/structcv_1_1cudev_1_1sin__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['sin_5ffunc_3c_20short_20_3e_1186',['sin_func< short >',['https://docs.opencv.org/4.2.0/dd/d6f/structcv_1_1cudev_1_1sin__func_3_01short_01_4.html',1,'cv::cudev']]], + ['sin_5ffunc_3c_20uchar_20_3e_1187',['sin_func< uchar >',['https://docs.opencv.org/4.2.0/d2/dfd/structcv_1_1cudev_1_1sin__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['sin_5ffunc_3c_20uint_20_3e_1188',['sin_func< uint >',['https://docs.opencv.org/4.2.0/d5/dbd/structcv_1_1cudev_1_1sin__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['sin_5ffunc_3c_20ushort_20_3e_1189',['sin_func< ushort >',['https://docs.opencv.org/4.2.0/d8/d22/structcv_1_1cudev_1_1sin__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['single_20output_1190',['Upscaling images: single-output',['https://docs.opencv.org/4.2.0/d5/d29/tutorial_dnn_superres_upscale_image_single.html',1,'']]], + ['singleclientwsserver_1191',['SingleClientWSServer',['../classnet_1_1websocket_1_1SingleClientWSServer.html',1,'net::websocket::SingleClientWSServer'],['../classnet_1_1websocket_1_1SingleClientWSServer.html#ac665bc5e8ae3112c4471b1352ddb2132',1,'net::websocket::SingleClientWSServer::SingleClientWSServer()']]], + ['singledimtrapezoidalvelocityprofile_1192',['SingleDimTrapezoidalVelocityProfile',['../classcontrol_1_1SingleDimTrapezoidalVelocityProfile.html',1,'control::SingleDimTrapezoidalVelocityProfile'],['../classcontrol_1_1SingleDimTrapezoidalVelocityProfile.html#a110579aeecbe2f5624ba3157af0712c7',1,'control::SingleDimTrapezoidalVelocityProfile::SingleDimTrapezoidalVelocityProfile()']]], + ['singlefeed_1193',['singleFeed',['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#aededd4813e3e2d35f79c04ac40fea9e3',1,'cv::detail::GainCompensator']]], + ['singlefpconfig_1194',['singleFPConfig',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a46207d759e1e39f0d64ccbac7bd444de',1,'cv::ocl::Device']]], + ['singlemaskchannels_1195',['SingleMaskChannels',['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html',1,'cv::cudev']]], + ['singlemaskchannels_1196',['singleMaskChannels',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a875afea6eef58cd5bd1ceb2d38ed96',1,'cv::cudev::singleMaskChannels()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a875afea6eef58cd5bd1ceb2d38ed96',1,'singleMaskChannels()(Global Namespace)']]], + ['singlemaskchannelssz_1197',['SingleMaskChannelsSz',['https://docs.opencv.org/4.2.0/d0/d19/structcv_1_1cudev_1_1SingleMaskChannelsSz.html',1,'cv::cudev']]], + ['singular_20value_20matrix_20decomposition_1198',['Singular value matrix decomposition',['https://docs.opencv.org/4.2.0/dd/d2a/group__core__hal__interface__decomp__svd.html',1,'']]], + ['singularvalues_1199',['singularValues',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a4e7bac123570c348f7ed6be909e1e474',1,'Eigen::SVDBase::singularValues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a4e7bac123570c348f7ed6be909e1e474',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::singularValues()']]], + ['sinh_1200',['sinh',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9c37eab2dc7baf83809269254c9129e0',1,'Eigen::MatrixBase::sinh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9c37eab2dc7baf83809269254c9129e0',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sinh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9c37eab2dc7baf83809269254c9129e0',1,'MatrixBase< Solve< Decomposition, RhsType > >::sinh()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772d44272d0bd7c7b67f16ea0b85cb80',1,'cv::cudev::sinh(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga344edc16853d27c854368f389d416065',1,'cv::cudev::sinh(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41fc9242b7523253e30be1597ee66ae',1,'cv::cudev::sinh(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddc053cb31f1c990c61111d1c6743dc2',1,'cv::cudev::sinh(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ca9a17c7a0fc5a6482d44925904591',1,'cv::cudev::sinh(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07e2a3dbaccc0f8545a04c2981b6893c',1,'cv::cudev::sinh(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga041bd4a026295d1ecd49292b72bcd9b0',1,'cv::cudev::sinh(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbfadd781ca9a813fc846d412e1bb8cb',1,'cv::cudev::sinh(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f6b210903dc62269c50728eac20a3f',1,'cv::cudev::sinh(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab486c1024c95760571e684fb39a2ee85',1,'cv::cudev::sinh(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa81c2145a67198bd56929f430f2278b2',1,'cv::cudev::sinh(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931ce3aa6bc08deb00c50fb03bf47ed3',1,'cv::cudev::sinh(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b71a067f79c91cc5f62b5f422b09c9',1,'cv::cudev::sinh(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1669c360c5924edd756ae9d9536eb8e4',1,'cv::cudev::sinh(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487d5848e17ac161e3776eecf48adcf6',1,'cv::cudev::sinh(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad385a12228a01205ba34ea7926f407a0',1,'cv::cudev::sinh(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1eaa0ad7b95a36a271c0afbbd8d7a0a',1,'cv::cudev::sinh(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87c9882d3f6d3ea06cf957fecceb1af1',1,'cv::cudev::sinh(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5162f3f12ea498b9fcc5a843ed6112cd',1,'cv::cudev::sinh(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4abff00111b20ef9070fd6c52ff6c4',1,'cv::cudev::sinh(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d6389dea5e2a1eee144bade28064c6',1,'cv::cudev::sinh(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b36fcf77ae7d883572908e070ef4b8c',1,'cv::cudev::sinh(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga693a5fecbc38f4ab58b6e42a5b26c711',1,'cv::cudev::sinh(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f05f7337e5c6b1ee245f37182398e51',1,'cv::cudev::sinh(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa641ed89c52fc91f854112ab277934ee',1,'cv::cudev::sinh(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5ae3dd563be525b52f9d614b44b0008',1,'cv::cudev::sinh(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb23dca771a80de9a2629878d60385e',1,'cv::cudev::sinh(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac10c00f0dc12cd8e4eeaad51330251bf',1,'cv::cudev::sinh(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e573cff24de567a8d3c8215ec25a686',1,'cv::cudev::sinh(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1372528a6d841534331bdd0270d9b87f',1,'cv::cudev::sinh(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac5d6219259ed327d126311d05f3f77d',1,'cv::cudev::sinh(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8a3df5e8a2b664bec6d194a8efc1b11',1,'cv::cudev::sinh(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772d44272d0bd7c7b67f16ea0b85cb80',1,'sinh(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga344edc16853d27c854368f389d416065',1,'sinh(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41fc9242b7523253e30be1597ee66ae',1,'sinh(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddc053cb31f1c990c61111d1c6743dc2',1,'sinh(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ca9a17c7a0fc5a6482d44925904591',1,'sinh(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07e2a3dbaccc0f8545a04c2981b6893c',1,'sinh(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga041bd4a026295d1ecd49292b72bcd9b0',1,'sinh(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbfadd781ca9a813fc846d412e1bb8cb',1,'sinh(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f6b210903dc62269c50728eac20a3f',1,'sinh(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab486c1024c95760571e684fb39a2ee85',1,'sinh(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa81c2145a67198bd56929f430f2278b2',1,'sinh(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931ce3aa6bc08deb00c50fb03bf47ed3',1,'sinh(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b71a067f79c91cc5f62b5f422b09c9',1,'sinh(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1669c360c5924edd756ae9d9536eb8e4',1,'sinh(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487d5848e17ac161e3776eecf48adcf6',1,'sinh(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad385a12228a01205ba34ea7926f407a0',1,'sinh(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1eaa0ad7b95a36a271c0afbbd8d7a0a',1,'sinh(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87c9882d3f6d3ea06cf957fecceb1af1',1,'sinh(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5162f3f12ea498b9fcc5a843ed6112cd',1,'sinh(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4abff00111b20ef9070fd6c52ff6c4',1,'sinh(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d6389dea5e2a1eee144bade28064c6',1,'sinh(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b36fcf77ae7d883572908e070ef4b8c',1,'sinh(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga693a5fecbc38f4ab58b6e42a5b26c711',1,'sinh(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f05f7337e5c6b1ee245f37182398e51',1,'sinh(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa641ed89c52fc91f854112ab277934ee',1,'sinh(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5ae3dd563be525b52f9d614b44b0008',1,'sinh(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb23dca771a80de9a2629878d60385e',1,'sinh(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac10c00f0dc12cd8e4eeaad51330251bf',1,'sinh(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e573cff24de567a8d3c8215ec25a686',1,'sinh(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1372528a6d841534331bdd0270d9b87f',1,'sinh(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac5d6219259ed327d126311d05f3f77d',1,'sinh(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8a3df5e8a2b664bec6d194a8efc1b11',1,'sinh(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae30c461aa90a3e7d502737e29898570b',1,'std::sinh()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae30c461aa90a3e7d502737e29898570b',1,'sinh()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af284ce359b6efd4b594a9f8a1f5e5d96',1,'Eigen::sinh()']]], + ['sinh_5f_1201',['sinh_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5670821e2cf464830fdd577155c97682',1,'cv::cudev::sinh_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5670821e2cf464830fdd577155c97682',1,'sinh_()(Global Namespace)']]], + ['sinh_5ffunc_1202',['sinh_func',['https://docs.opencv.org/4.2.0/d8/da0/structcv_1_1cudev_1_1sinh__func.html',1,'cv::cudev']]], + ['sinh_5ffunc_3c_20double_20_3e_1203',['sinh_func< double >',['https://docs.opencv.org/4.2.0/db/dde/structcv_1_1cudev_1_1sinh__func_3_01double_01_4.html',1,'cv::cudev']]], + ['sinh_5ffunc_3c_20float_20_3e_1204',['sinh_func< float >',['https://docs.opencv.org/4.2.0/d3/df1/structcv_1_1cudev_1_1sinh__func_3_01float_01_4.html',1,'cv::cudev']]], + ['sinh_5ffunc_3c_20schar_20_3e_1205',['sinh_func< schar >',['https://docs.opencv.org/4.2.0/de/df6/structcv_1_1cudev_1_1sinh__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['sinh_5ffunc_3c_20short_20_3e_1206',['sinh_func< short >',['https://docs.opencv.org/4.2.0/da/d3e/structcv_1_1cudev_1_1sinh__func_3_01short_01_4.html',1,'cv::cudev']]], + ['sinh_5ffunc_3c_20uchar_20_3e_1207',['sinh_func< uchar >',['https://docs.opencv.org/4.2.0/d4/dd2/structcv_1_1cudev_1_1sinh__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['sinh_5ffunc_3c_20uint_20_3e_1208',['sinh_func< uint >',['https://docs.opencv.org/4.2.0/de/d13/structcv_1_1cudev_1_1sinh__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['sinh_5ffunc_3c_20ushort_20_3e_1209',['sinh_func< ushort >',['https://docs.opencv.org/4.2.0/d9/d38/structcv_1_1cudev_1_1sinh__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['sinus_1210',['SINUS',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#ggaf0af0db4c870be3ef86132870821d452a2b23baf7ce23f7583fe2a584728b77ae',1,'cv::ft::SINUS'],['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html#ggaf0af0db4c870be3ef86132870821d452a2b23baf7ce23f7583fe2a584728b77ae',1,'SINUS(Global Namespace)']]], + ['sinusoidal_20pattern_20tutorial_1211',['Capture Sinusoidal pattern tutorial',['https://docs.opencv.org/4.2.0/d0/de8/tutorial_capture_sinusoidal_pattern.html',1,'']]], + ['sinusoidalpattern_1212',['SinusoidalPattern',['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1structured__light_1_1SinusoidalPattern.html',1,'cv::structured_light']]], + ['sinusoidalpattern_2ehpp_1213',['sinusoidalpattern.hpp',['https://docs.opencv.org/4.2.0/d5/de0/sinusoidalpattern_8hpp.html',1,'']]], + ['size_1214',['Size',['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html',1,'cv::gapi::own::Size'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#a414d94d96776dd293fadcccc8bb8d945',1,'cv::gapi::own::Size::Size()=default'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#ad47bebdef94e1a54723cd603a0cad05a',1,'cv::gapi::own::Size::Size(int _width, int _height)'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#aa209bef3a32994815d6e6a431f2c4d79',1,'cv::gapi::own::Size::Size(const cv::Size &other)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga346f563897249351a34549137c8532a0',1,'cv::Size'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga346f563897249351a34549137c8532a0',1,'Size(Global Namespace)']]], + ['size_1215',['size',['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#a0aa1b9d10cb5790c13977c7ef3d60589',1,'cv::BOWTrainer::size'],['https://docs.opencv.org/4.2.0/d9/daa/structcvhalKeyPoint.html#a595113ae7b221433c941ed1bf1fcfc74',1,'cvhalKeyPoint::size'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#a57434b53bae97ab6bedbb134acadc22b',1,'cv::detail::DisjointSets::size'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a76b5615e48bff202e58eb1943d50d499',1,'cv::GMatDesc::size'],['https://docs.opencv.org/4.2.0/d9/d8b/structhashtable__int.html#af2fcd9f790e42fd58daef178dcd7ad49',1,'hashtable_int::size'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#ac90d9bd519dc9d1c1c03bac053f5293a',1,'cv::SparseMat::Hdr::size'],['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a3d23124ae5d210ba5ba5faebf5e89f3c',1,'cv::line_descriptor::KeyLine::size'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#a308006c9f963547a8cff61548ddd2ef2',1,'cv::KeyPoint::size'],['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#a04afb9bb9e17c59094a2b1e2a87e44b9',1,'cv::dnn::LRNLayer::size'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a146f8e8dda07d1365a575ab83d9828d1',1,'cv::Mat::size'],['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a42ec820537c8749494a65784dbb44261',1,'cv::NAryMatIterator::size'],['https://docs.opencv.org/4.2.0/d2/d12/structNCVMemSegment.html#a376bdfb501e8f18ba89e4966e1d76ae8',1,'NCVMemSegment::size'],['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#aa31c426771eec1a37fb4b916671c92a9',1,'NppStInterpolationState::size'],['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#a1c3369153b15c7f673d2afd5b07a55c1',1,'cv::videostab::RansacParams::size'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a68ac6414ed3233245175e2c4f3b2bbfb',1,'cv::RotatedRect::size'],['https://docs.opencv.org/4.2.0/dd/d08/structcv_1_1cudev_1_1TupleTraits.html#a4b22d3c775a55301f774790aacd5cc44ab44ae6417c21f32d2d7d5e9fe9c970d7',1,'cv::cudev::TupleTraits::size'],['https://docs.opencv.org/4.2.0/d2/dae/structcv_1_1cudev_1_1TupleTraits_3_01tuple_3_01P0_00_01P1_00_01P2_00_01P3_00_01P4_00_01P5_00_01P41642a2d25b95a5ddb87ca2004b28336.html#a5b3f0e699ccd1c7722a083dbd5c90c9ba0797302a76304c5e3772a9680585391e',1,'cv::cudev::TupleTraits< tuple< P0, P1, P2, P3, P4, P5, P6, P7, P8, P9 > >::size'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a762e5567b5c5636f6c1de2c260b12065',1,'cv::UMat::size'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#ab3bf7b4c0a3f1206def1008d9f9150ba',1,'cv::UMatData::size'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0d8ed64f7bbbda6d34e3289681ffdff0',1,'cv::_InputArray::size()'],['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a6f9bc2bcf2fed70c4a6b49f62b7b01bd',1,'cv::ogl::Arrays::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'cv::AutoBuffer::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'AutoBuffer< double, 1 >::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'AutoBuffer< int64, 1 >::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'AutoBuffer< String, 1 >::size()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#af627f6025672dcd3f054667da63f6ae1',1,'cv::ogl::Buffer::size()'],['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a18e35a5bce978c5729ef5ea58b1fee28',1,'cv::DescriptorMatcher::DescriptorCollection::size()'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#addb04c93f4b075a6343d62222f446afc',1,'cv::dnn::DictValue::size()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a05c11e00d20223cde61677de91c71197',1,'cv::FileNode::size()'],['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1flann_1_1GenericIndex.html#affe04ca85a1e20d655ad972ba9b3d72a',1,'cv::flann::GenericIndex::size()'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#aaf653cfda76e2067c792290d509d2fc5',1,'cv::gapi::GKernelPackage::size()'],['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#a111ea435bae91141a418e9ce8f5f31b2',1,'cv::optflow::GPCTrainingSamples::size()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ab02f97698d8272f0d253f3029329ed10',1,'cv::cuda::GpuMat::size()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#aa61acd6d1db2ec950221831dc3fe1ca9',1,'cv::cuda::HostMem::size()'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1tbm_1_1IImageDescriptor.html#a9217032891d76e5e4b1b153af86ec275',1,'cv::tbm::IImageDescriptor::size()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8b5fcf3cec72903e2692e5c71e1c283b',1,'cv::MatExpr::size()'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a80309fab69773987e1c740279b82abd1',1,'cv::MatOp::size()'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#a78d401af8024a6bdacde4886a5538dbe',1,'NCVMatrix::size()'],['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#a202fc148a0ad8df135215ecf1781a0b8',1,'cv::Range::size()'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#ab0c92d80e25e22be48c0110c5200da1e',1,'cv::Rect_::size()'],['https://docs.opencv.org/4.2.0/d5/d34/classcv_1_1tbm_1_1ResizedImageDescriptor.html#a73954a1918519059b34189e3792b4559',1,'cv::tbm::ResizedImageDescriptor::size()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a65eac830987646a4792815ad4e717c3e',1,'cv::SparseMat::size() const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a4fe9c986b3cf0240c68ce985df334c17',1,'cv::SparseMat::size(int i) const'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a65f84b8b7f310fa80d6ca0e1e80be492',1,'cv::ogl::Texture2D::size()'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a57cc6b1a08cb876f8aecc76a4051763c',1,'cv::tbm::Track::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a942b15c04edb2c0c0635d22b50dfa338',1,'__gnu_cxx::__versa_string::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a9bc2a952203a764d5a1cdf80f94bd2a8',1,'__gnu_cxx::temporary_buffer::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'__gnu_debug::basic_string::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< _CharT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< _CharT, _Traits, _Allocator >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< char >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< char, char_traits< char >, _Byte_alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< char_type, _Traits, _Alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< value_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a24d5150e384f657ca3b317ced4dadc5d',1,'deque< _StateSeqT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4b6c305dd92e3c76213778feba213da2',1,'list< __inp, __rebind_inp >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a2ceef4213eb87e16e8fe124fa54a7ea7',1,'match_results< _Bi_iter >::size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a2ceef4213eb87e16e8fe124fa54a7ea7',1,'match_results< _Bi_iter >::size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a625c78a7dc1b563f9754e33879243f4e',1,'stack< _StateSeqT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a9bc2a952203a764d5a1cdf80f94bd2a8',1,'std::_Temporary_buffer::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'std::basic_string::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#acae6b747171db72a7f5b80f698972874',1,'std::bitset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a24d5150e384f657ca3b317ced4dadc5d',1,'std::deque::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaeabfccb9dc90c70b63e73149b026ccf5',1,'std::gslice::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4b6c305dd92e3c76213778feba213da2',1,'std::list::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ab8dd27409135bbee5bb626cd72e0cddb',1,'std::map::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a2ceef4213eb87e16e8fe124fa54a7ea7',1,'std::match_results::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a99416d1336342563c08a44ad664c74a3',1,'std::multimap::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aa0d42b46c75769cbce93494ac80c8c34',1,'std::multiset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#a22575e222bea1d4bdd5e978b2d6c3b04',1,'std::priority_queue::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#a39a435e44d6ff36f98f21dc45a2ac7f0',1,'std::queue::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab21409945167dfbfd999f005739cbc2a',1,'std::set::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5b1a5398fdc4ecf20576f3cae02ea8fc',1,'std::slice::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a625c78a7dc1b563f9754e33879243f4e',1,'std::stack::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aa80249a927b88d3e03afce4993630c17',1,'std::tr2::dynamic_bitset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d1de2c7389176716aceeaba3b1c2bb7',1,'std::unordered_map::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af02efb64c18107a5c4f13a1983cfa5a3',1,'std::unordered_multimap::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#acd836983ff93b793bf5404002ceac468',1,'std::unordered_multiset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a73ec5052e45a7a980d1968a0805a32dd',1,'std::unordered_set::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga351ffb24ad6654f7f5f8b10731fc8c95',1,'std::valarray::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'std::vector::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d1de2c7389176716aceeaba3b1c2bb7',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga351ffb24ad6654f7f5f8b10731fc8c95',1,'valarray< size_t >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< __diff_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _CharClassT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _CharT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _Cmpt >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _Node *, _Nodeptr_Alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _RealType >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _State< _TraitsT::char_type > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _StringT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< block_type, allocator_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< Catalog_info * >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< double >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< int >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< result_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< size_t >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< std::pair< _BiIter, int > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< std::pair< _StateIdT, std::vector > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< std::pair< _StrTransT, _StrTransT > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< sub_match< _Bi_iter >, _Alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< sub_match< _BiIter >, _Alloc >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArithmeticSequence.html#a59c45682aae07a2ce72f7781b420c0d6',1,'Eigen::ArithmeticSequence::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::EigenBase::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< FullPivLU< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< HouseholderQR< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Inverse< PermutationType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< LLT< _MatrixType, _UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PartialPivLU< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PermutationWrapper< _IndicesType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SVDBase< Derived > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Transpose< MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< TriangularView< MatrixType, Mode > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'Eigen::PermutationBase::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< PermutationWrapper< _IndicesType > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'Eigen::SparseMatrixBase::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< Transpose< MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::size()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a33c7c8638bb0b12e6d1b69d8106dd2e0.html#a33c7c8638bb0b12e6d1b69d8106dd2e0',1,'nlohmann::basic_json::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5b1a5398fdc4ecf20576f3cae02ea8fc',1,'size() const(Global Namespace)']]], + ['size_20vectorizable_20eigen_20objects_1216',['Fixed-size vectorizable Eigen objects',['https://eigen.tuxfamily.org/dox/group__TopicFixedSizeVectorizable.html',1,'']]], + ['size2d_1217',['Size2d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaff96e5bec8019ca9917fd1e4c0cf8267',1,'cv::Size2d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaff96e5bec8019ca9917fd1e4c0cf8267',1,'Size2d(Global Namespace)']]], + ['size2f_1218',['Size2f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gab34496d2466b5f69930ab74c70f117d4',1,'cv::Size2f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gab34496d2466b5f69930ab74c70f117d4',1,'Size2f(Global Namespace)']]], + ['size2i_1219',['Size2i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5ef7f5978948e0cb3c3a3d4172594aec',1,'cv::Size2i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5ef7f5978948e0cb3c3a3d4172594aec',1,'Size2i(Global Namespace)']]], + ['size2l_1220',['Size2l',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga153b6b90ce30f84239c9a39613e836d3',1,'cv::Size2l'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga153b6b90ce30f84239c9a39613e836d3',1,'Size2l(Global Namespace)']]], + ['size_5f_1221',['Size_',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html',1,'cv::Size_< _Tp >'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae09ae11fd75a16928ca40980ad46a9bf',1,'cv::Size_::Size_()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a45c97e9a4930d73fde11c2acc5f371ac',1,'cv::Size_::Size_(_Tp _width, _Tp _height)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#abe760f15bf01a0ee3f51d81f4f8ea259',1,'cv::Size_::Size_(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae220b36673041edafc81c0e9677eb609',1,'cv::Size_::Size_(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2c6d59e6fe58dc2cda78504271b7ec6c',1,'cv::Size_::Size_(const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae09ae11fd75a16928ca40980ad46a9bf',1,'Size_< float >::Size_()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a45c97e9a4930d73fde11c2acc5f371ac',1,'Size_< float >::Size_(float _width, float _height)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#abe760f15bf01a0ee3f51d81f4f8ea259',1,'Size_< float >::Size_(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae220b36673041edafc81c0e9677eb609',1,'Size_< float >::Size_(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2c6d59e6fe58dc2cda78504271b7ec6c',1,'Size_< float >::Size_(const Point_< float > &pt)']]], + ['size_5f_3c_20float_20_3e_1222',['Size_< float >',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html',1,'cv::Size_< float >'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html',1,'Size_< float >']]], + ['size_5ffn_5fimps_2ehpp_1223',['size_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01292.html',1,'']]], + ['size_5frow_1224',['SIZE_ROW',['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#a2be14e0142d3c05eb8f7fd101da897b2',1,'cv::cuda::ORB::SIZE_ROW'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a3b5156553e52661b04bf02fa9628f746afab69397159f91277ff725c76b2cdcba',1,'cv::cuda::SURF_CUDA::SIZE_ROW']]], + ['size_5ftype_1225',['size_type',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a23e0cc13f851ac190d768b12c3dae3b1',1,'cv::Allocator::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11171.html#a74744bfab3764b78a3cf339de9479a80',1,'__gnu_pbds::hash_prime_size_policy::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11787.html#af4fea3ec891b02cccd88355a969c90ba',1,'__gnu_pbds::sample_range_hashing::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#afa708b47ccdbdfd9e35edc2121fd2d89',1,'__gnu_pbds::sample_resize_policy::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a201fc8206c4854233d6290f37c35458b',1,'__gnu_pbds::sample_resize_trigger::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12015.html#a655a04ece92c1f5542fdf3f89c934c07',1,'__gnu_pbds::sample_size_policy::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#acb7ab4835031bde4cbf2787c341b7cb7',1,'__gnu_pbds::trie_prefix_search_node_update::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a528d5c1afff59af1a90aa9273dddb806',1,'allocator_traits< _Tp_alloc_type >::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a528d5c1afff59af1a90aa9273dddb806',1,'std::allocator_traits::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#af1836ee16fd652969eb06007c273edd0',1,'std::allocator_traits< allocator< _Tp > >::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ad9837325cd001566e32eb95539a8ded5',1,'std::set::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ad9837325cd001566e32eb95539a8ded5',1,'std::set::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acefc3dbfc16b70562f92193d01156479',1,'std::unordered_map::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acefc3dbfc16b70562f92193d01156479',1,'std::unordered_map::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ab9e187c541bf3fe290dd21b514abd024',1,'std::unordered_multimap::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ab9e187c541bf3fe290dd21b514abd024',1,'std::unordered_multimap::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a530f5c88d1e5082a61c5b38948e1cfdb',1,'std::unordered_multiset::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a530f5c88d1e5082a61c5b38948e1cfdb',1,'std::unordered_multiset::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a489606b8c31cc86a461912f292dac389',1,'std::unordered_set::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a489606b8c31cc86a461912f292dac389',1,'std::unordered_set::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acefc3dbfc16b70562f92193d01156479',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::size_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acefc3dbfc16b70562f92193d01156479',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::size_type'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3ada29bca70b4965f6fd37ec1c8f85f7.html#a3ada29bca70b4965f6fd37ec1c8f85f7',1,'nlohmann::basic_json::size_type']]], + ['sizeatcompiletime_1226',['SizeAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da25cb495affdbd796198462b8ef06be91',1,'Eigen::DenseBase::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da25cb495affdbd796198462b8ef06be91',1,'DenseBase< ArrayWrapper< ExpressionType > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da25cb495affdbd796198462b8ef06be91',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da25cb495affdbd796198462b8ef06be91',1,'DenseBase< Solve< Decomposition, RhsType > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1aa5022cfa2bb53129883e9b7b8abd3d68',1,'Eigen::SparseMatrixBase::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1aa5022cfa2bb53129883e9b7b8abd3d68',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1aa5022cfa2bb53129883e9b7b8abd3d68',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1aa5022cfa2bb53129883e9b7b8abd3d68',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1aa5022cfa2bb53129883e9b7b8abd3d68',1,'SparseMatrixBase< Transpose< MatrixType > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1aa5022cfa2bb53129883e9b7b8abd3d68',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a687d3c44b9eaf8adac51d1ed796ba4f0a41d03efb5f764a9e647974c83581ca0e',1,'Eigen::TriangularBase::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a687d3c44b9eaf8adac51d1ed796ba4f0a41d03efb5f764a9e647974c83581ca0e',1,'TriangularBase< SelfAdjointView< _MatrixType, UpLo > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a687d3c44b9eaf8adac51d1ed796ba4f0a41d03efb5f764a9e647974c83581ca0e',1,'TriangularBase< SelfAdjointView< const Derived, UpLo > >::SizeAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a687d3c44b9eaf8adac51d1ed796ba4f0a41d03efb5f764a9e647974c83581ca0e',1,'TriangularBase< TriangularView< _MatrixType, _Mode > >::SizeAtCompileTime']]], + ['sizend_1227',['sizend',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7cb4cadf3108dc232e05e3ae5550e912',1,'cv::_InputArray']]], + ['sizes_1228',['sizes',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a4d0f2228231a351280a1b14b1915fe7b',1,'Eigen::AlignedBox']]], + ['sizes_5f_1229',['sizes_',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a5abe230ead5af1b35d94cb3f2b867787',1,'cv::detail::PairwiseSeamFinder']]], + ['skeleton_1230',['skeleton',['https://docs.opencv.org/4.2.0/d4/d66/structcv_1_1datasets_1_1skeleton.html',1,'cv::datasets']]], + ['skeletons_1231',['skeletons',['https://docs.opencv.org/4.2.0/d3/dad/structcv_1_1datasets_1_1GR__chalearnObj.html#a1b1069e0014fda9b87792e0932d67ef8',1,'cv::datasets::GR_chalearnObj']]], + ['skew_1232',['skew',['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga281f0a5a7375c577d33672cb33604718',1,'cv::sfm::skew()'],['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga281f0a5a7375c577d33672cb33604718',1,'skew(InputArray x)(Global Namespace)']]], + ['skip_5fexisting_1233',['skip_existing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a061f6d61eab01c92e56fcac8789b6b9d',1,'skip_existing(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a061f6d61eab01c92e56fcac8789b6b9d',1,'skip_existing(Global Namespace)']]], + ['skip_5fsymlinks_1234',['skip_symlinks',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298aef4a262c2a436cce67818b680933529e',1,'skip_symlinks(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298aef4a262c2a436cce67818b680933529e',1,'skip_symlinks(Global Namespace)']]], + ['skipjunk_1235',['skipJunk',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ab175c66eb8d1e86abeaa1fc2203e70d5',1,'cv::AVIReadContainer::skipJunk(RiffChunk &chunk)'],['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ad5800e79427105fdb22f9819f83c245b',1,'cv::AVIReadContainer::skipJunk(RiffList &list)']]], + ['skipws_1236',['skipws',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'basic_ios< char, _Traits >::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'basic_iostream< char >::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'basic_istream< char >::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'basic_istream< char, _Traits >::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'basic_ostream< char >::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'basic_ostream< char, _Traits >::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_fstream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_ifstream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_ios::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_iostream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_istream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_istringstream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_ofstream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_ostream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_ostringstream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::basic_stringstream::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a0092524de17db6438bc3bdcb914ac62b',1,'std::ios_base::skipws'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad458fa76ad203ae00a0fb1c602ec1cf6',1,'std::skipws()']]], + ['sl2_1237',['SL2',['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html',1,'cv']]], + ['slam_1238',['SLAM',['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html',1,'']]], + ['slam_5fkitti_1239',['SLAM_kitti',['https://docs.opencv.org/4.2.0/d6/d92/classcv_1_1datasets_1_1SLAM__kitti.html',1,'cv::datasets']]], + ['slam_5fkitti_2ehpp_1240',['slam_kitti.hpp',['https://docs.opencv.org/4.2.0/dc/d1e/slam__kitti_8hpp.html',1,'']]], + ['slam_5fkittiobj_1241',['SLAM_kittiObj',['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html',1,'cv::datasets']]], + ['slam_5ftumindoor_1242',['SLAM_tumindoor',['https://docs.opencv.org/4.2.0/da/d91/classcv_1_1datasets_1_1SLAM__tumindoor.html',1,'cv::datasets']]], + ['slam_5ftumindoor_2ehpp_1243',['slam_tumindoor.hpp',['https://docs.opencv.org/4.2.0/df/d91/slam__tumindoor_8hpp.html',1,'']]], + ['slam_5ftumindoorobj_1244',['SLAM_tumindoorObj',['https://docs.opencv.org/4.2.0/d7/d56/structcv_1_1datasets_1_1SLAM__tumindoorObj.html',1,'cv::datasets']]], + ['sleep_5ffor_1245',['sleep_for',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01566.html#a7ddb6a2d48e0bb2cace6dd67c4c38596',1,'std::this_thread']]], + ['sleep_5funtil_1246',['sleep_until',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01566.html#a277096a2cdd1fc66b7569f457b731bfb',1,'std::this_thread']]], + ['slerp_1247',['slerp',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'Eigen::QuaternionBase::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ab9ceb217d03c6a2a6438be37a3ccd855',1,'Eigen::Rotation2D::slerp()']]], + ['slic_1248',['SLIC',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gga6c6f7deab0bd328066f0ada72c2ce57ba14bff8b90df89890367525f0de4f3409',1,'cv::ximgproc::SLIC'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gga6c6f7deab0bd328066f0ada72c2ce57ba14bff8b90df89890367525f0de4f3409',1,'SLIC(Global Namespace)']]], + ['slic_2ehpp_1249',['slic.hpp',['https://docs.opencv.org/4.2.0/df/d2b/slic_8hpp.html',1,'']]], + ['slice_1250',['slice',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07115.html',1,'std::slice'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6a83c2410180b69ca38a2da2c4c984b9',1,'std::slice::slice()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9cc9983faafa145460d264127f7fd816',1,'std::slice::slice(size_t __o, size_t __d, size_t __s)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#ae14f6407db835831e8d5b8cc3693b808',1,'cv::dnn::slice(const Mat &m, const _Range &r0)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a72905f90ed70aefb3146201c774e6538',1,'cv::dnn::slice(const Mat &m, const _Range &r0, const _Range &r1)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a40066b7362eb3f88901507fbc44087d7',1,'cv::dnn::slice(const Mat &m, const _Range &r0, const _Range &r1, const _Range &r2)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#ac81609723c58d6db31a2b046a02e3311',1,'cv::dnn::slice(const Mat &m, const _Range &r0, const _Range &r1, const _Range &r2, const _Range &r3)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6a83c2410180b69ca38a2da2c4c984b9',1,'slice()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9cc9983faafa145460d264127f7fd816',1,'slice(size_t __o, size_t __d, size_t __s)(Global Namespace)']]], + ['slice_5farray_1251',['slice_array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04651.html',1,'std::slice_array< _Tp >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga886109b8edc60759a1c07ed209bf6110',1,'std::slice_array::slice_array()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga886109b8edc60759a1c07ed209bf6110',1,'slice_array(const slice_array &)(Global Namespace)']]], + ['slice_5farray_2eh_1252',['slice_array.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00512.html',1,'']]], + ['sliceend_1253',['sliceEnd',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a135e544f96bb39f2fe713dfd1ab02d02',1,'cv::MatConstIterator']]], + ['slicelayer_1254',['SliceLayer',['https://docs.opencv.org/4.2.0/de/d61/classcv_1_1dnn_1_1SliceLayer.html',1,'cv::dnn']]], + ['sliceranges_1255',['sliceRanges',['https://docs.opencv.org/4.2.0/de/d61/classcv_1_1dnn_1_1SliceLayer.html#a958e398c3d89f75b8d2f14e54303401e',1,'cv::dnn::SliceLayer']]], + ['slicestart_1256',['sliceStart',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a0b9062870872eadbb5bdda0580e3ea3f',1,'cv::MatConstIterator']]], + ['slicing_20and_20indexing_1257',['Slicing and Indexing',['https://eigen.tuxfamily.org/dox/group__TutorialSlicingIndexing.html',1,'']]], + ['slico_1258',['SLICO',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gga6c6f7deab0bd328066f0ada72c2ce57ba9b397d2eb2d75580b3a481bf8e0edef1',1,'cv::ximgproc::SLICO'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gga6c6f7deab0bd328066f0ada72c2ce57ba9b397d2eb2d75580b3a481bf8e0edef1',1,'SLICO(Global Namespace)']]], + ['slictype_1259',['SLICType',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#ga6c6f7deab0bd328066f0ada72c2ce57b',1,'cv::ximgproc::SLICType'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#ga6c6f7deab0bd328066f0ada72c2ce57b',1,'SLICType(Global Namespace)']]], + ['slist_1260',['slist',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09335.html',1,'__gnu_cxx::slist< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00869.html',1,'(Global Namespace)']]], + ['smallestangle_1261',['smallestAngle',['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ac648b9217d9f7ba4ee7a1a91aec8e46f',1,'Eigen::Rotation2D']]], + ['smallestpositiveangle_1262',['smallestPositiveAngle',['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a09c5195aa9a154551b2edf6ed4f22ab6',1,'Eigen::Rotation2D']]], + ['smallregionremoval_1263',['smallRegionRemoval',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a0c4797c9f4efff3dacc87a748bd05038',1,'cv::stereo::Matching']]], + ['smallwinsize_1264',['smallWinSize',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#ad84db18639f2f9f8a2287b05cb11aefd',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['smem_5ftuple_1265',['smem_tuple',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada9ddc5dd0880d539295fca6c71b1a43',1,'cv::cudev::smem_tuple(T0 *t0)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f5d4d674113e05e6e7634d0e4611d5',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a5947043131d608a3c093795baf5a2',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8498c67667e736f8669853bc01cdc2bf',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb9373e84cb0a13dd14cd4fa4aff4e1',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef4a5236e533195fafad8278b2c5e620',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af9cdcf327bd26e3bf201366508978c',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9438b5a9c4cf14df89be071081f959c',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadae9554fedac7876dee14809422714bc',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee998c9e69107c84770286d11ed10deb',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8, T9 *t9)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada9ddc5dd0880d539295fca6c71b1a43',1,'smem_tuple(T0 *t0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f5d4d674113e05e6e7634d0e4611d5',1,'smem_tuple(T0 *t0, T1 *t1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a5947043131d608a3c093795baf5a2',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8498c67667e736f8669853bc01cdc2bf',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb9373e84cb0a13dd14cd4fa4aff4e1',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef4a5236e533195fafad8278b2c5e620',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af9cdcf327bd26e3bf201366508978c',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9438b5a9c4cf14df89be071081f959c',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadae9554fedac7876dee14809422714bc',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee998c9e69107c84770286d11ed10deb',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8, T9 *t9)(Global Namespace)']]], + ['smoothing_20images_1266',['Smoothing Images',['https://docs.opencv.org/4.2.0/dc/dd3/tutorial_gausian_median_blur_bilateral_filter.html',1,'Smoothing Images'],['https://docs.opencv.org/4.2.0/d4/d13/tutorial_py_filtering.html',1,'Smoothing Images'],['https://docs.opencv.org/4.2.0/dd/d6a/tutorial_js_filtering.html',1,'Smoothing Images']]], + ['snextc_1267',['snextc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'__gnu_cxx::enc_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'__gnu_cxx::stdio_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'__gnu_cxx::stdio_sync_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_filebuf< char_type, traits_type >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_streambuf< _Elem, _Tr >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_streambuf< char, _Traits >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_streambuf< char, char_traits< char > >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::basic_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::basic_streambuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::basic_stringbuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::wbuffer_convert::snextc()']]], + ['sobel_1268',['Sobel',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gacea54f142e81b6758cb6f375ce782c8d',1,'cv::Sobel()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gae1443445c4cb3187dcf439a57cfa534f',1,'cv::gapi::Sobel()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gacea54f142e81b6758cb6f375ce782c8d',1,'Sobel(InputArray src, OutputArray dst, int ddepth, int dx, int dy, int ksize=3, double scale=1, double delta=0, int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gae1443445c4cb3187dcf439a57cfa534f',1,'Sobel(const GMat &src, int ddepth, int dx, int dy, int ksize=3, double scale=1, double delta=0, int borderType=BORDER_DEFAULT, const Scalar &borderValue=Scalar(0))(Global Namespace)']]], + ['sobel_20derivatives_1269',['Sobel Derivatives',['https://docs.opencv.org/4.2.0/d2/d2c/tutorial_sobel_derivatives.html',1,'']]], + ['sobel_5fderivatives_2emarkdown_1270',['sobel_derivatives.markdown',['https://docs.opencv.org/4.2.0/d8/d3a/sobel__derivatives_8markdown.html',1,'']]], + ['sobelx_5f_1271',['sobelX_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga945d37fbb4c7155744f8c05da3942cf7',1,'cv::cudev::sobelX_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga945d37fbb4c7155744f8c05da3942cf7',1,'sobelX_()(Global Namespace)']]], + ['sobelxptr_1272',['SobelXPtr',['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1SobelXPtr.html',1,'cv::cudev']]], + ['sobelxptr_1273',['sobelXPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73acbb3438525083fa2fa9d0295243de',1,'cv::cudev::sobelXPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73acbb3438525083fa2fa9d0295243de',1,'sobelXPtr()(Global Namespace)']]], + ['sobelxptrsz_1274',['SobelXPtrSz',['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1cudev_1_1SobelXPtrSz.html',1,'cv::cudev']]], + ['sobelxy_1275',['SobelXY',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga675a82fe875fb789e50dc17ab775f59b',1,'cv::gapi::SobelXY()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga675a82fe875fb789e50dc17ab775f59b',1,'SobelXY()(Global Namespace)']]], + ['sobely_5f_1276',['sobelY_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga279cba6bb715d130d5f267aa7aa8d8e0',1,'cv::cudev::sobelY_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga279cba6bb715d130d5f267aa7aa8d8e0',1,'sobelY_()(Global Namespace)']]], + ['sobelyptr_1277',['SobelYPtr',['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1SobelYPtr.html',1,'cv::cudev']]], + ['sobelyptr_1278',['sobelYPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e67a64ceb921f54607d12ee7dcdb57',1,'cv::cudev::sobelYPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e67a64ceb921f54607d12ee7dcdb57',1,'sobelYPtr()(Global Namespace)']]], + ['sobelyptrsz_1279',['SobelYPtrSz',['https://docs.opencv.org/4.2.0/dd/dc6/structcv_1_1cudev_1_1SobelYPtrSz.html',1,'cv::cudev']]], + ['soft_5fmargin_1280',['SOFT_MARGIN',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a9b5c495b5593ffda8a7055da07d0b751a8d6a7f40e040703bb29dd3896b86cc9c',1,'cv::ml::SVMSGD']]], + ['softdouble_1281',['softdouble',['https://docs.opencv.org/4.2.0/de/df1/structcv_1_1softdouble.html',1,'cv::softdouble'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaeeadf92dca0d8472616f8608fdcb241e',1,'cv::softdouble::softdouble()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c2434a765a38cafc214c81b54239742',1,'cv::softdouble::softdouble(const softdouble &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga136cdc02508643e0c523b83fe4abd6ca',1,'cv::softdouble::softdouble(const uint32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad6c2c15092e4652a37c32ae066b498aa',1,'cv::softdouble::softdouble(const uint64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga91be418b1b6f40094a8212c5997e680a',1,'cv::softdouble::softdouble(const int32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad2ef086e5378199006e95bab0913cbaf',1,'cv::softdouble::softdouble(const int64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab0ba4201e29886459956de5500d51672',1,'cv::softdouble::softdouble(const double a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaeeadf92dca0d8472616f8608fdcb241e',1,'softdouble()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c2434a765a38cafc214c81b54239742',1,'softdouble(const softdouble &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga136cdc02508643e0c523b83fe4abd6ca',1,'softdouble(const uint32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad6c2c15092e4652a37c32ae066b498aa',1,'softdouble(const uint64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga91be418b1b6f40094a8212c5997e680a',1,'softdouble(const int32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad2ef086e5378199006e95bab0913cbaf',1,'softdouble(const int64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab0ba4201e29886459956de5500d51672',1,'softdouble(const double a)(Global Namespace)']]], + ['softfloat_1282',['softfloat',['https://docs.opencv.org/4.2.0/d7/d2f/structcv_1_1softfloat.html',1,'cv::softfloat'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3bff550288d8719474fe71f463fbfc7f',1,'cv::softfloat::softfloat()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga1a4225942d70d185f9e046d6c863df31',1,'cv::softfloat::softfloat(const softfloat &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga79cdf60b97caf7ba8093f24b8fbbf92c',1,'cv::softfloat::softfloat(const uint32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga16fc78346e0adfbe62a1e6e61939289c',1,'cv::softfloat::softfloat(const uint64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadc3eed39f933f4924ac16a0be93df54c',1,'cv::softfloat::softfloat(const int32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga66426ab441c67a01df01529ccc46521c',1,'cv::softfloat::softfloat(const int64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga04202c2edb5f1f8f75e806fb37abc3b9',1,'cv::softfloat::softfloat(const float a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3bff550288d8719474fe71f463fbfc7f',1,'softfloat()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga1a4225942d70d185f9e046d6c863df31',1,'softfloat(const softfloat &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga79cdf60b97caf7ba8093f24b8fbbf92c',1,'softfloat(const uint32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga16fc78346e0adfbe62a1e6e61939289c',1,'softfloat(const uint64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadc3eed39f933f4924ac16a0be93df54c',1,'softfloat(const int32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga66426ab441c67a01df01529ccc46521c',1,'softfloat(const int64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga04202c2edb5f1f8f75e806fb37abc3b9',1,'softfloat(const float a)(Global Namespace)']]], + ['softfloat_20support_1283',['Softfloat support',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html',1,'']]], + ['softfloat_2ehpp_1284',['softfloat.hpp',['https://docs.opencv.org/4.2.0/db/d2e/softfloat_8hpp.html',1,'']]], + ['softmaxlayer_1285',['SoftmaxLayer',['https://docs.opencv.org/4.2.0/d8/d18/classcv_1_1dnn_1_1SoftmaxLayer.html',1,'cv::dnn']]], + ['solve_1286',['Solve',['https://eigen.tuxfamily.org/dox/classEigen_1_1Solve.html',1,'Eigen']]], + ['solve_1287',['solve',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'cv::Matx::solve(const Matx< _Tp, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'cv::Matx::solve(const Vec< _Tp, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< _Tp, cn, 1 >::solve(const Matx< _Tp, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< _Tp, cn, 1 >::solve(const Vec< _Tp, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 1, 3 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 1, 3 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 2, 2 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 2, 2 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 2, 3 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 2, 3 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 3, 3 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 3, 3 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 3, 4 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 3, 4 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 4, 4 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 4, 4 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, cn, 1 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, cn, 1 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float, 2, 3 >::solve(const Matx< float, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float, 2, 3 >::solve(const Vec< float, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float, 3, 3 >::solve(const Matx< float, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float, 3, 3 >::solve(const Vec< float, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float, cn, 1 >::solve(const Matx< float, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float, cn, 1 >::solve(const Vec< float, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float_type, 4, 4 >::solve(const Matx< float_type, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float_type, 4, 4 >::solve(const Vec< float_type, m > &rhs, int method) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aaa9c4af89930ab3bb7612ed9ae33d3f5',1,'Eigen::ColPivHouseholderQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aaa9c4af89930ab3bb7612ed9ae33d3f5',1,'ColPivHouseholderQR< MatrixType >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ab303e177cc7df17e435c79dca9ef5654',1,'Eigen::CompleteOrthogonalDecomposition::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a6f1b0a116c78e642e3d2a100a29d1a4a',1,'Eigen::FullPivHouseholderQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#af563471f6f3283fd10779ef02dd0b748',1,'Eigen::FullPivLU::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#a3e8e56769bbaaed0616ad98c4ff99c7b',1,'Eigen::HouseholderQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#aa257dd7a8acf8b347d5a22a13d6ca3e1',1,'Eigen::LDLT::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a3738bb3ce6f9b837a2beb432b937499f',1,'Eigen::LLT::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a49247bd2f742a46bca1f9c2bf1b19ad8',1,'Eigen::PartialPivLU::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'Eigen::SolverBase::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< FullPivLU< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< HouseholderQR< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< LLT< _MatrixType, _UpLo > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< PartialPivLU< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< SVDBase< Derived > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a1a0c8d5e08202f159553ceb01afb07d6',1,'Eigen::SparseLU::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a2892802e7cc880357af770ee02515859',1,'Eigen::SparseQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'Eigen::SparseSolverBase::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'Eigen::SparseSolverBase::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< IncompleteLUT< _Scalar, int > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< IncompleteLUT< _Scalar, int > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< KLU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< KLU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< SuperILU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< SuperILU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< SuperLU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< SuperLU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< UmfPackLU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< UmfPackLU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#ab28499936c0764fe5b56b9f4de701e26',1,'Eigen::SVDBase::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#ab28499936c0764fe5b56b9f4de701e26',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a911664ccf5522c778ffc5405247e8a59',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::solve()'],['../classkinematics_1_1ArmKinematics.html#a34487a1615ea239fba599f86bc3df913',1,'kinematics::ArmKinematics::solve()'],['../classkinematics_1_1InverseArmKinematics.html#a566ec29651bdf0b09fcd5b4bfe2e7d29',1,'kinematics::InverseArmKinematics::solve()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga12b43690dbd31fed96f213eefead2373',1,'cv::solve()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga12b43690dbd31fed96f213eefead2373',1,'solve()(Global Namespace)']]], + ['solvecubic_1288',['solveCubic',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1c3b0b925b085b6e96931ee309e6a1da',1,'cv::solveCubic()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1c3b0b925b085b6e96931ee309e6a1da',1,'solveCubic()(Global Namespace)']]], + ['solveinplace_1289',['solveInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a43bae99c287250d6092c8f8d1ba90e91',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::solveInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01MatrixType_00_01Mode_00_01Sparse_01_4.html#a3f3385e827fcc0bf27d1ec21c80740bc',1,'Eigen::TriangularViewImpl< MatrixType, Mode, Sparse >::solveInPlace(MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01MatrixType_00_01Mode_00_01Sparse_01_4.html#a70190d4105e1fd4f27abbf73365dfa0c',1,'Eigen::TriangularViewImpl< MatrixType, Mode, Sparse >::solveInPlace(SparseMatrixBase< OtherDerived > &other) const']]], + ['solvelp_1290',['solveLP',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#ga9a06d237a9d38ace891efa1ca1b5d00a',1,'cv::solveLP()'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#ga9a06d237a9d38ace891efa1ca1b5d00a',1,'solveLP()(Global Namespace)']]], + ['solvelp_5fmulti_1291',['SOLVELP_MULTI',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14ca94f9f0f66b795a4df9861e236064f1f0',1,'cv::SOLVELP_MULTI'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14ca94f9f0f66b795a4df9861e236064f1f0',1,'SOLVELP_MULTI(Global Namespace)']]], + ['solvelp_5fsingle_1292',['SOLVELP_SINGLE',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14ca4f5a045a7b15b7b64acee6107b76e7b5',1,'cv::SOLVELP_SINGLE'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14ca4f5a045a7b15b7b64acee6107b76e7b5',1,'SOLVELP_SINGLE(Global Namespace)']]], + ['solvelp_5funbounded_1293',['SOLVELP_UNBOUNDED',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14ca53443e5084b8afbd368920564a005e6b',1,'cv::SOLVELP_UNBOUNDED'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14ca53443e5084b8afbd368920564a005e6b',1,'SOLVELP_UNBOUNDED(Global Namespace)']]], + ['solvelp_5funfeasible_1294',['SOLVELP_UNFEASIBLE',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14cae1450427844e557ad644cb4fcd44edef',1,'cv::SOLVELP_UNFEASIBLE'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#gga86a370deffb37af51deb405a634eb14cae1450427844e557ad644cb4fcd44edef',1,'SOLVELP_UNFEASIBLE(Global Namespace)']]], + ['solvelpresult_1295',['SolveLPResult',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#ga86a370deffb37af51deb405a634eb14c',1,'cv::SolveLPResult'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#ga86a370deffb37af51deb405a634eb14c',1,'SolveLPResult(Global Namespace)']]], + ['solvep3p_1296',['solveP3P',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gae5af86788e99948d40b39a03f6acf623',1,'cv::solveP3P()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gae5af86788e99948d40b39a03f6acf623',1,'solveP3P()(Global Namespace)']]], + ['solvepnp_1297',['solvePnP',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga549c2075fac14829ff4a58bc931c033d',1,'cv::solvePnP()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga549c2075fac14829ff4a58bc931c033d',1,'solvePnP()(Global Namespace)']]], + ['solvepnp_5fap3p_1298',['SOLVEPNP_AP3P',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869a8d48dece2da6492d91fa2de0a04679f9',1,'cv::SOLVEPNP_AP3P'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869a8d48dece2da6492d91fa2de0a04679f9',1,'SOLVEPNP_AP3P(Global Namespace)']]], + ['solvepnp_5fdls_1299',['SOLVEPNP_DLS',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869aa51f13248282b8778003b9a4cf8ac07e',1,'cv::SOLVEPNP_DLS'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869aa51f13248282b8778003b9a4cf8ac07e',1,'SOLVEPNP_DLS(Global Namespace)']]], + ['solvepnp_5fepnp_1300',['SOLVEPNP_EPNP',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869ae25763f5155defc67ef0f68b74d6c074',1,'cv::SOLVEPNP_EPNP'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869ae25763f5155defc67ef0f68b74d6c074',1,'SOLVEPNP_EPNP(Global Namespace)']]], + ['solvepnp_5fippe_1301',['SOLVEPNP_IPPE',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869acbd7d9f9513a22a59412661a9d31ca3d',1,'cv::SOLVEPNP_IPPE'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869acbd7d9f9513a22a59412661a9d31ca3d',1,'SOLVEPNP_IPPE(Global Namespace)']]], + ['solvepnp_5fippe_5fsquare_1302',['SOLVEPNP_IPPE_SQUARE',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869ac5d28b2805d3ac32fd477eee4479406f',1,'cv::SOLVEPNP_IPPE_SQUARE'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869ac5d28b2805d3ac32fd477eee4479406f',1,'SOLVEPNP_IPPE_SQUARE(Global Namespace)']]], + ['solvepnp_5fiterative_1303',['SOLVEPNP_ITERATIVE',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869a9f589872a7f7d687dc58294e01ea33a5',1,'cv::SOLVEPNP_ITERATIVE'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869a9f589872a7f7d687dc58294e01ea33a5',1,'SOLVEPNP_ITERATIVE(Global Namespace)']]], + ['solvepnp_5fp3p_1304',['SOLVEPNP_P3P',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869af33a85ca698777ff9bd1de916bf5959a',1,'cv::SOLVEPNP_P3P'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869af33a85ca698777ff9bd1de916bf5959a',1,'SOLVEPNP_P3P(Global Namespace)']]], + ['solvepnp_5fupnp_1305',['SOLVEPNP_UPNP',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869a2859c9ce1430662096d3cc3b5462847f',1,'cv::SOLVEPNP_UPNP'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gga357634492a94efe8858d0ce1509da869a2859c9ce1430662096d3cc3b5462847f',1,'SOLVEPNP_UPNP(Global Namespace)']]], + ['solvepnpgeneric_1306',['solvePnPGeneric',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga624af8a6641b9bdb487f63f694e8bb90',1,'cv::solvePnPGeneric()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga624af8a6641b9bdb487f63f694e8bb90',1,'solvePnPGeneric()(Global Namespace)']]], + ['solvepnpmethod_1307',['SolvePnPMethod',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga357634492a94efe8858d0ce1509da869',1,'cv::SolvePnPMethod'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga357634492a94efe8858d0ce1509da869',1,'SolvePnPMethod(Global Namespace)']]], + ['solvepnpransac_1308',['solvePnPRansac',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga50620f0e26e02caa2e9adc07b5fbf24e',1,'cv::solvePnPRansac()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga585fcff4132c58f83132e72df5bab179',1,'cv::cuda::solvePnPRansac()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga50620f0e26e02caa2e9adc07b5fbf24e',1,'solvePnPRansac(InputArray objectPoints, InputArray imagePoints, InputArray cameraMatrix, InputArray distCoeffs, OutputArray rvec, OutputArray tvec, bool useExtrinsicGuess=false, int iterationsCount=100, float reprojectionError=8.0, double confidence=0.99, OutputArray inliers=noArray(), int flags=SOLVEPNP_ITERATIVE)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga585fcff4132c58f83132e72df5bab179',1,'solvePnPRansac(const Mat &object, const Mat &image, const Mat &camera_mat, const Mat &dist_coef, Mat &rvec, Mat &tvec, bool use_extrinsic_guess=false, int num_iters=100, float max_dist=8.0, int min_inlier_count=100, std::vector< int > *inliers=NULL)(Global Namespace)']]], + ['solvepnprefinelm_1309',['solvePnPRefineLM',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga650ba4d286a96d992f82c3e6dfa525fa',1,'cv::solvePnPRefineLM()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga650ba4d286a96d992f82c3e6dfa525fa',1,'solvePnPRefineLM()(Global Namespace)']]], + ['solvepnprefinevvs_1310',['solvePnPRefineVVS',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga17491c0282e4af874f6206a9166774a5',1,'cv::solvePnPRefineVVS()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga17491c0282e4af874f6206a9166774a5',1,'solvePnPRefineVVS()(Global Namespace)']]], + ['solvepoly_1311',['solvePoly',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gac2f5e953016fabcdf793d762f4ec5dce',1,'cv::solvePoly()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gac2f5e953016fabcdf793d762f4ec5dce',1,'solvePoly()(Global Namespace)']]], + ['solverbase_1312',['SolverBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'Eigen::SolverBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'Eigen::SolverBase::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< FullPivLU< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< HouseholderQR< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< LLT< _MatrixType, _UpLo > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< PartialPivLU< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< SVDBase< Derived > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::SolverBase()']]], + ['solverbase_3c_20colpivhouseholderqr_3c_20_5fmatrixtype_20_3e_20_3e_1313',['SolverBase< ColPivHouseholderQR< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], + ['solverbase_3c_20colpivhouseholderqr_3c_20matrixtype_20_3e_20_3e_1314',['SolverBase< ColPivHouseholderQR< MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], + ['solverbase_3c_20completeorthogonaldecomposition_3c_20_5fmatrixtype_20_3e_20_3e_1315',['SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], + ['solverbase_3c_20fullpivhouseholderqr_3c_20_5fmatrixtype_20_3e_20_3e_1316',['SolverBase< FullPivHouseholderQR< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], + ['solverbase_3c_20fullpivlu_3c_20_5fmatrixtype_20_3e_20_3e_1317',['SolverBase< FullPivLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], + ['solverbase_3c_20householderqr_3c_20_5fmatrixtype_20_3e_20_3e_1318',['SolverBase< HouseholderQR< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], + ['solverbase_3c_20ldlt_3c_20_5fmatrixtype_2c_20_5fuplo_20_3e_20_3e_1319',['SolverBase< LDLT< _MatrixType, _UpLo > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], + ['solverbase_3c_20llt_3c_20_5fmatrixtype_2c_20_5fuplo_20_3e_20_3e_1320',['SolverBase< LLT< _MatrixType, _UpLo > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], + ['solverbase_3c_20partialpivlu_3c_20_5fmatrixtype_20_3e_20_3e_1321',['SolverBase< PartialPivLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], + ['solverbase_3c_20svdbase_3c_20derived_20_3e_20_3e_1322',['SolverBase< SVDBase< Derived > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], + ['solverbase_3c_20svdbase_3c_20jacobisvd_3c_20_5fmatrixtype_2c_20qrpreconditioner_20_3e_20_3e_20_3e_1323',['SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html',1,'']]], + ['solvers_1324',['Matrix-free solvers',['https://eigen.tuxfamily.org/dox/group__MatrixfreeSolverExample.html',1,'']]], + ['solverstorage_1325',['SolverStorage',['https://eigen.tuxfamily.org/dox/structEigen_1_1SolverStorage.html',1,'Eigen']]], + ['solvertype_1326',['SolverType',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gaac4a33e26da30a5c5aa1ed3f66fc0998',1,'cv::optflow::SolverType'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gaac4a33e26da30a5c5aa1ed3f66fc0998',1,'SolverType(Global Namespace)']]], + ['solvertype_1327',['solverType',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a03f2326fd7c314d6ed1ff841fcdc7dc1',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['solvewithguess_1328',['SolveWithGuess',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolveWithGuess.html',1,'Eigen']]], + ['solvewithguess_1329',['solveWithGuess',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#adcc18d1ab283786dcbb5a3f63f4b4bd8',1,'Eigen::IterativeSolverBase']]], + ['solvez_1330',['solveZ',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#ab255cd24a882ab993fb2f7377ef2774a',1,'cv::SVD']]], + ['solving_20linear_20least_20squares_20systems_1331',['Solving linear least squares systems',['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'']]], + ['solving_20sparse_20linear_20systems_1332',['Solving Sparse Linear Systems',['https://eigen.tuxfamily.org/dox/group__TopicSparseSystems.html',1,'']]], + ['some_20data_20structures_1333',['Some Data Structures',['https://docs.opencv.org/4.2.0/d5/df1/tutorial_js_some_data_structures.html',1,'']]], + ['sort_1334',['sort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a150b5b104440ea65709e70a7f2eba06b',1,'list< __inp, __rebind_inp >::sort()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a96029060c6dd54dc811b3c0d59b06537',1,'list< __inp, __rebind_inp >::sort(_StrictWeakOrdering)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a4bb37711f3350692a1246d7781967ea6',1,'std::forward_list::sort()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a3f59eaf1f58f480eafa906d68d408682',1,'std::forward_list::sort(_Comp __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a150b5b104440ea65709e70a7f2eba06b',1,'std::list::sort()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a96029060c6dd54dc811b3c0d59b06537',1,'std::list::sort(_StrictWeakOrdering)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga45dd56da289494ce874be2324856898f',1,'cv::sort()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga45dd56da289494ce874be2324856898f',1,'sort()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga4ea03048647c50ea7cbdd5da30e82755',1,'std::sort(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gae3c0067ae83db1824367ded659a960b2',1,'std::sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga4ea03048647c50ea7cbdd5da30e82755',1,'sort(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gae3c0067ae83db1824367ded659a960b2',1,'sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], + ['sort_2eh_1335',['sort.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00971.html',1,'']]], + ['sort_5fascending_1336',['SORT_ASCENDING',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667ba62b054bb27aeefd25fb6728034b630a2',1,'cv::SORT_ASCENDING'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667ba62b054bb27aeefd25fb6728034b630a2',1,'SORT_ASCENDING(Global Namespace)']]], + ['sort_5fdescending_1337',['SORT_DESCENDING',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667bac23176acbd1cbe51058088d1358367dc',1,'cv::SORT_DESCENDING'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667bac23176acbd1cbe51058088d1358367dc',1,'SORT_DESCENDING(Global Namespace)']]], + ['sort_5fevery_5fcolumn_1338',['SORT_EVERY_COLUMN',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667ba5be81ea78c4ed2dc7aca349d5dabec36',1,'cv::SORT_EVERY_COLUMN'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667ba5be81ea78c4ed2dc7aca349d5dabec36',1,'SORT_EVERY_COLUMN(Global Namespace)']]], + ['sort_5fevery_5frow_1339',['SORT_EVERY_ROW',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667ba9776827c6c057260be34311392e6b618',1,'cv::SORT_EVERY_ROW'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga8e88a1f27e41e12f81caab17cf81667ba9776827c6c057260be34311392e6b618',1,'SORT_EVERY_ROW(Global Namespace)']]], + ['sort_5fheap_1340',['sort_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga7e302d6652402edae355b8726b2b7e27',1,'std::sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga441060fda917c1aed4e8fab9c860f706',1,'std::sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga7e302d6652402edae355b8726b2b7e27',1,'sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga441060fda917c1aed4e8fab9c860f706',1,'sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], + ['sort_5fminimal_5fn_1341',['sort_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a16e8a6461d487c29d0657c8f48575616',1,'__gnu_parallel::_Settings']]], + ['sort_5fmwms_5foversampling_1342',['sort_mwms_oversampling',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a0f435bbb73735fb8fdec296eed3c5996',1,'__gnu_parallel::_Settings']]], + ['sort_5fqs_5fnum_5fsamples_5fpreset_1343',['sort_qs_num_samples_preset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a5d52b268aa07e731f6b01ff2fdd49904',1,'__gnu_parallel::_Settings']]], + ['sort_5fqsb_5fbase_5fcase_5fmaximal_5fn_1344',['sort_qsb_base_case_maximal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a3a0bbce1f017d9a3ea2ea176722ed853',1,'__gnu_parallel::_Settings']]], + ['sortflags_1345',['SortFlags',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga8e88a1f27e41e12f81caab17cf81667b',1,'cv::SortFlags'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga8e88a1f27e41e12f81caab17cf81667b',1,'SortFlags(Global Namespace)']]], + ['sortidx_1346',['sortIdx',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadf35157cbf97f3cb85a545380e383506',1,'cv::sortIdx()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadf35157cbf97f3cb85a545380e383506',1,'sortIdx(InputArray src, OutputArray dst, int flags)(Global Namespace)']]], + ['sorting_1347',['Sorting',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html',1,'']]], + ['source_1348',['source',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#aa5ae8887e0dc06f966ba83aaf4102666',1,'cv::ocl::Program::source()'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a456b1a9829e6474696410160b180293a',1,'cv::ocl::ProgramSource::source()']]], + ['source_2ehpp_1349',['source.hpp',['https://docs.opencv.org/4.2.0/d2/d2e/source_8hpp.html',1,'']]], + ['space_20conversions_1350',['Color Space Conversions',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html',1,'']]], + ['space_20processing_1351',['Color space processing',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html',1,'']]], + ['space_20to_20another_1352',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], + ['space_20transformations_1353',['Space transformations',['https://eigen.tuxfamily.org/dox/group__TutorialGeometry.html',1,'']]], + ['spaces_1354',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], + ['sparse_1355',['Sparse',['https://eigen.tuxfamily.org/dox/structEigen_1_1Sparse.html',1,'Eigen']]], + ['sparse_20linear_20algebra_1356',['Sparse linear algebra',['https://eigen.tuxfamily.org/dox/group__Sparse__chapter.html',1,'']]], + ['sparse_20linear_20systems_1357',['Solving Sparse Linear Systems',['https://eigen.tuxfamily.org/dox/group__TopicSparseSystems.html',1,'']]], + ['sparse_20matrices_1358',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], + ['sparse_20matrix_20manipulations_1359',['Sparse matrix manipulations',['https://eigen.tuxfamily.org/dox/group__TutorialSparse.html',1,'']]], + ['sparse_20meta_20module_1360',['Sparse meta-module',['https://eigen.tuxfamily.org/dox/group__Sparse__Module.html',1,'']]], + ['sparse_5fmatch_5finterpolator_2ehpp_1361',['sparse_match_interpolator.hpp',['https://docs.opencv.org/4.2.0/d6/dcd/sparse__match__interpolator_8hpp.html',1,'']]], + ['sparse_5fmatching_5fgpc_2ehpp_1362',['sparse_matching_gpc.hpp',['https://docs.opencv.org/4.2.0/d8/dc5/sparse__matching__gpc_8hpp.html',1,'']]], + ['sparsecholesky_20module_1363',['SparseCholesky module',['https://eigen.tuxfamily.org/dox/group__SparseCholesky__Module.html',1,'']]], + ['sparsecompressedbase_1364',['SparseCompressedBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'Eigen::SparseCompressedBase'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'Eigen::SparseCompressedBase::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Derived >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Transpose< MatrixType > >::SparseCompressedBase()']]], + ['sparsecompressedbase_3c_20block_3c_20const_20sparsematrix_3c_20_5fscalar_2c_20_5foptions_2c_20_5fstorageindex_20_3e_2c_20blockrows_2c_20blockcols_2c_20true_20_3e_20_3e_1365',['SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], + ['sparsecompressedbase_3c_20block_3c_20sparsematrix_3c_20_5fscalar_2c_20_5foptions_2c_20_5fstorageindex_20_3e_2c_20blockrows_2c_20blockcols_2c_20true_20_3e_20_3e_1366',['SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], + ['sparsecompressedbase_3c_20block_3c_20sparsematrixtype_2c_20blockrows_2c_20blockcols_2c_20true_20_3e_20_3e_1367',['SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], + ['sparsecompressedbase_3c_20derived_20_3e_1368',['SparseCompressedBase< Derived >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], + ['sparsecompressedbase_3c_20sparsematrix_3c_20_5fscalar_2c_20_5foptions_2c_20_5fstorageindex_20_3e_20_3e_1369',['SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], + ['sparsecompressedbase_3c_20sparsematrix_3c_20scalar_2c_20_5foptions_2c_20_5fstorageindex_20_3e_20_3e_1370',['SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], + ['sparsecompressedbase_3c_20sparsematrix_3c_20scalar_2c_20_5foptions_2c_20int_20_3e_20_3e_1371',['SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], + ['sparsecompressedbase_3c_20sparsematrix_3c_20scalar_2c_20_5foptions_2c_20storageindex_20_3e_20_3e_1372',['SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], + ['sparsecompressedbase_3c_20transpose_3c_20matrixtype_20_3e_20_3e_1373',['SparseCompressedBase< Transpose< MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html',1,'']]], + ['sparsecore_20module_1374',['SparseCore module',['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html',1,'']]], + ['sparselu_1375',['SparseLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html',1,'Eigen']]], + ['sparselu_20module_1376',['SparseLU module',['https://eigen.tuxfamily.org/dox/group__SparseLU__Module.html',1,'']]], + ['sparsemapbase_3c_20derived_2c_20readonlyaccessors_20_3e_1377',['SparseMapBase< Derived, ReadOnlyAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html',1,'Eigen']]], + ['sparsemapbase_3c_20derived_2c_20writeaccessors_20_3e_1378',['SparseMapBase< Derived, WriteAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html',1,'Eigen']]], + ['sparsemat_1379',['SparseMat',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html',1,'cv::SparseMat'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a9b5f1214a43144122b158c354a93e338',1,'cv::SparseMat::SparseMat()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a62224fe4fbdc6134d80861a150e01b58',1,'cv::SparseMat::SparseMat(int dims, const int *_sizes, int _type)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a753add6192d4355c04e6e3594ab97b49',1,'cv::SparseMat::SparseMat(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af9432a94bda00c7fd2103bcd57654d03',1,'cv::SparseMat::SparseMat(const Mat &m)']]], + ['sparsemat_5f_1380',['SparseMat_',['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html',1,'cv::SparseMat_< _Tp >'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a359e83f7b4372d439ad31a84e72cd12d',1,'cv::SparseMat_::SparseMat_()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#adb611458d46e670dcaf099f1fceddf9c',1,'cv::SparseMat_::SparseMat_(int dims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ab0e9b029a622c637e17f8288d968f25c',1,'cv::SparseMat_::SparseMat_(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a773ae7065a51b5440d0d9c8b87b7eba3',1,'cv::SparseMat_::SparseMat_(const SparseMat_ &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a0938540b46ceeca038f396f019b1e3c4',1,'cv::SparseMat_::SparseMat_(const Mat &m)']]], + ['sparsematchinterpolator_1381',['SparseMatchInterpolator',['https://docs.opencv.org/4.2.0/d4/da8/classcv_1_1ximgproc_1_1SparseMatchInterpolator.html',1,'cv::ximgproc']]], + ['sparsematconstiterator_1382',['SparseMatConstIterator',['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html',1,'cv::SparseMatConstIterator'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#af3502cb42a852646d4f8cfed6e3b3c6b',1,'cv::SparseMatConstIterator::SparseMatConstIterator()'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a74e586f5019f8993d34da6dd9eaa74e8',1,'cv::SparseMatConstIterator::SparseMatConstIterator(const SparseMat *_m)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a7549ff275790855409b1da3b14a85ddd',1,'cv::SparseMatConstIterator::SparseMatConstIterator(const SparseMatConstIterator &it)']]], + ['sparsematconstiterator_5f_1383',['SparseMatConstIterator_',['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html',1,'cv::SparseMatConstIterator_< class >'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#ae840ff1fdc9aa20eac7953703f42a8ef',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#ac318c1458cb5078b03db72db21ac6de5',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_(const SparseMat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#addc0f436bbbf166ce0ff8a5455ff5009',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_(const SparseMat *_m)'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a5cfedc1a27fb81a75dbd8df905ec83b5',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_(const SparseMatConstIterator_ &it)']]], + ['sparsematiterator_1384',['SparseMatIterator',['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html',1,'cv::SparseMatIterator'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a40c1749ef7155fed17b82e2eb233c1d4',1,'cv::SparseMatIterator::SparseMatIterator()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a57bc97f37b1504118bee50c38b2fca2a',1,'cv::SparseMatIterator::SparseMatIterator(SparseMat *_m)'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a302209fba84cdd382c3c0ae7b6e3a064',1,'cv::SparseMatIterator::SparseMatIterator(SparseMat *_m, const int *idx)'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a567658fd3bf0d621f8249b3ddf6140f4',1,'cv::SparseMatIterator::SparseMatIterator(const SparseMatIterator &it)']]], + ['sparsematiterator_5f_1385',['SparseMatIterator_',['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html',1,'cv::SparseMatIterator_< class >'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a404a0443b24c1139f2c2b914cc468180',1,'cv::SparseMatIterator_::SparseMatIterator_()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#aa07345c1dc666f06d49018130a48aaee',1,'cv::SparseMatIterator_::SparseMatIterator_(SparseMat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a1c965fbfa854ab5bcb0e56ca051fb6c4',1,'cv::SparseMatIterator_::SparseMatIterator_(SparseMat *_m)'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a6d4b4fd6b4f061e0d95f1927130b15d4',1,'cv::SparseMatIterator_::SparseMatIterator_(const SparseMatIterator_ &it)']]], + ['sparsematrix_1386',['SparseMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html',1,'Eigen::SparseMatrix< class, _Options, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'Eigen::SparseMatrix::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'Eigen::SparseMatrix::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'Eigen::SparseMatrix::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'Eigen::SparseMatrix::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'Eigen::SparseMatrix::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'Eigen::SparseMatrix::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'Eigen::SparseMatrix::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar >::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(Index rows, Index cols)']]], + ['sparsematrix_3c_20scalar_20_3e_1387',['SparseMatrix< Scalar >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html',1,'']]], + ['sparsematrix_3c_20scalar_2c_20colmajor_2c_20int_20_3e_1388',['SparseMatrix< Scalar, ColMajor, int >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html',1,'']]], + ['sparsematrix_3c_20scalar_2c_20colmajor_2c_20storageindex_20_3e_1389',['SparseMatrix< Scalar, ColMajor, StorageIndex >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html',1,'']]], + ['sparsematrix_3c_20scalar_2c_20rowmajor_2c_20storageindex_20_3e_1390',['SparseMatrix< Scalar, RowMajor, StorageIndex >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html',1,'']]], + ['sparsematrixbase_1391',['SparseMatrixBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html',1,'Eigen']]], + ['sparsematrixbase_3c_20block_3c_20xprtype_2c_20blockrows_2c_20blockcols_2c_20innerpanel_20_3e_20_3e_1392',['SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html',1,'']]], + ['sparsematrixbase_3c_20block_3c_20xprtype_2c_20blockrows_2c_20blockcols_2c_20true_20_3e_20_3e_1393',['SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html',1,'']]], + ['sparsematrixbase_3c_20cwisebinaryop_3c_20binaryop_2c_20lhs_2c_20rhs_20_3e_20_3e_1394',['SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html',1,'']]], + ['sparsematrixbase_3c_20transpose_3c_20matrixtype_20_3e_20_3e_1395',['SparseMatrixBase< Transpose< MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html',1,'']]], + ['sparsematrixbase_3c_20triangularview_3c_20matrixtype_2c_20mode_20_3e_20_3e_1396',['SparseMatrixBase< TriangularView< MatrixType, Mode > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html',1,'']]], + ['sparseopticalflow_1397',['SparseOpticalFlow',['https://docs.opencv.org/4.2.0/d5/dcf/classcv_1_1cuda_1_1SparseOpticalFlow.html',1,'cv::cuda::SparseOpticalFlow'],['https://docs.opencv.org/4.2.0/de/d14/classcv_1_1SparseOpticalFlow.html',1,'cv::SparseOpticalFlow']]], + ['sparsepyrlkoptflowestimator_1398',['SparsePyrLkOptFlowEstimator',['https://docs.opencv.org/4.2.0/d1/d4b/classcv_1_1videostab_1_1SparsePyrLkOptFlowEstimator.html',1,'cv::videostab']]], + ['sparsepyrlkopticalflow_1399',['SparsePyrLKOpticalFlow',['https://docs.opencv.org/4.2.0/d7/d05/classcv_1_1cuda_1_1SparsePyrLKOpticalFlow.html',1,'cv::cuda::SparsePyrLKOpticalFlow'],['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html',1,'cv::SparsePyrLKOpticalFlow']]], + ['sparseqr_1400',['SparseQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html',1,'Eigen::SparseQR'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a33f76a247183dc50c9c1cbf151288839',1,'Eigen::SparseQR::SparseQR()']]], + ['sparseqr_20module_1401',['SparseQR module',['https://eigen.tuxfamily.org/dox/group__SparseQR__Module.html',1,'']]], + ['sparserate_1402',['sparseRate',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#a65605ddda7dd90c5bc3201585e276e16',1,'cv::optflow::OpticalFlowPCAFlow']]], + ['sparserlofopticalflow_1403',['SparseRLOFOpticalFlow',['https://docs.opencv.org/4.2.0/df/dc4/classcv_1_1optflow_1_1SparseRLOFOpticalFlow.html',1,'cv::optflow']]], + ['sparseselfadjointview_1404',['SparseSelfAdjointView',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html',1,'Eigen']]], + ['sparseselfadjointview_3c_20const_20derived_2c_20uplo_20_3e_1405',['SparseSelfAdjointView< const Derived, UpLo >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html',1,'']]], + ['sparsesolverbase_1406',['SparseSolverBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'Eigen::SparseSolverBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'Eigen::SparseSolverBase::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< IncompleteLUT< _Scalar, int > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< KLU< _MatrixType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< SuperILU< _MatrixType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< SuperLU< _MatrixType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< UmfPackLU< _MatrixType > >::SparseSolverBase()']]], + ['sparsesolverbase_3c_20cholmoddecomposition_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_1407',['SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], + ['sparsesolverbase_3c_20cholmodsimplicialldlt_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_1408',['SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], + ['sparsesolverbase_3c_20cholmodsimplicialllt_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_1409',['SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], + ['sparsesolverbase_3c_20cholmodsupernodalllt_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_1410',['SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], + ['sparsesolverbase_3c_20incompletecholesky_3c_20scalar_2c_20lower_2c_20amdordering_3c_20int_20_3e_20_3e_20_3e_1411',['SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], + ['sparsesolverbase_3c_20incompletelut_3c_20_5fscalar_2c_20int_20_3e_20_3e_1412',['SparseSolverBase< IncompleteLUT< _Scalar, int > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], + ['sparsesolverbase_3c_20klu_3c_20_5fmatrixtype_20_3e_20_3e_1413',['SparseSolverBase< KLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], + ['sparsesolverbase_3c_20sparselutransposeview_3c_20conjugate_2c_20sparselutype_20_3e_20_3e_1414',['SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], + ['sparsesolverbase_3c_20superilu_3c_20_5fmatrixtype_20_3e_20_3e_1415',['SparseSolverBase< SuperILU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], + ['sparsesolverbase_3c_20superlu_3c_20_5fmatrixtype_20_3e_20_3e_1416',['SparseSolverBase< SuperLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], + ['sparsesolverbase_3c_20umfpacklu_3c_20_5fmatrixtype_20_3e_20_3e_1417',['SparseSolverBase< UmfPackLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html',1,'']]], + ['sparsevector_1418',['SparseVector',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html',1,'Eigen']]], + ['sparseview_1419',['SparseView',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseView.html',1,'Eigen']]], + ['sparseview_1420',['sparseView',['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'Eigen::MatrixBase::sparseView()'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sparseView()'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'MatrixBase< Solve< Decomposition, RhsType > >::sparseView()'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'sparseView()(Global Namespace)']]], + ['spatialgradient_1421',['spatialGradient',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga405d03b20c782b65a4daf54d233239a2',1,'cv::spatialGradient()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga405d03b20c782b65a4daf54d233239a2',1,'spatialGradient()(Global Namespace)']]], + ['spatialscale_1422',['spatialScale',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#aa0eba7ed083df27e764c4d1a85004032',1,'cv::dnn::PoolingLayer']]], + ['specfun_2eh_1423',['specfun.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00515.html',1,'']]], + ['special_20functions_1424',['Special Functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html',1,'Mathematical Special Functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html',1,'Mathematical Special Functions']]], + ['specialfilter_1425',['SpecialFilter',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gad8e695e87dee497e227716576c244598',1,'cv::SpecialFilter'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gad8e695e87dee497e227716576c244598',1,'SpecialFilter(Global Namespace)']]], + ['specifytype_1426',['specifyType',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#a6541ff9f95d789c14807e990dcb55ee9',1,'cv::detail::GArrayU']]], + ['specklex_1427',['speckleX',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a860c2b18eb7ed0d728bb8f689391cf3b',1,'cv::stereo::Matching']]], + ['speckley_1428',['speckleY',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#ae0b6479e54384522a02f6714b83bcd0e',1,'cv::stereo::Matching']]], + ['speeded_20up_20robust_20features_1429',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], + ['sph_5fbessel_1430',['sph_bessel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga478e517ed975bcb256de230e64f0fda5',1,'std::sph_bessel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2bf44b5e5a3b33d518d8a49e06433ece',1,'std::tr1::sph_bessel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga478e517ed975bcb256de230e64f0fda5',1,'sph_bessel(unsigned int __n, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2bf44b5e5a3b33d518d8a49e06433ece',1,'sph_bessel(unsigned int __n, _Tp __x)(Global Namespace)']]], + ['sph_5fbesself_1431',['sph_besself',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga534e36e1dcefad8daec98920db16eec4',1,'std::sph_besself()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga534e36e1dcefad8daec98920db16eec4',1,'sph_besself()(Global Namespace)']]], + ['sph_5fbessell_1432',['sph_bessell',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga11d72b1af81ce9da3c878a25087ee927',1,'std::sph_bessell()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga11d72b1af81ce9da3c878a25087ee927',1,'sph_bessell()(Global Namespace)']]], + ['sph_5flegendre_1433',['sph_legendre',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga573842c12247b87746b548f1945755a8',1,'std::sph_legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga6281837b14f373c4b331509580f66b35',1,'std::tr1::sph_legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga573842c12247b87746b548f1945755a8',1,'sph_legendre(unsigned int __l, unsigned int __m, _Tp __theta)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga6281837b14f373c4b331509580f66b35',1,'sph_legendre(unsigned int __l, unsigned int __m, _Tp __theta)(Global Namespace)']]], + ['sph_5flegendref_1434',['sph_legendref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaae635d28c06a3be2679901b382090852',1,'std::sph_legendref()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaae635d28c06a3be2679901b382090852',1,'sph_legendref()(Global Namespace)']]], + ['sph_5flegendrel_1435',['sph_legendrel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga2f6618dea1847f09fd67f3c974c1910d',1,'std::sph_legendrel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga2f6618dea1847f09fd67f3c974c1910d',1,'sph_legendrel()(Global Namespace)']]], + ['sph_5fneumann_1436',['sph_neumann',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1cf4362a67ab5bae9e6b69c867e85371',1,'std::sph_neumann()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2d353e21ed716e078f26147fb603ed33',1,'std::tr1::sph_neumann()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1cf4362a67ab5bae9e6b69c867e85371',1,'sph_neumann(unsigned int __n, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2d353e21ed716e078f26147fb603ed33',1,'sph_neumann(unsigned int __n, _Tp __x)(Global Namespace)']]], + ['sph_5fneumannf_1437',['sph_neumannf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga789143122fa99536329bc2d1b1aac2f0',1,'std::sph_neumannf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga789143122fa99536329bc2d1b1aac2f0',1,'sph_neumannf()(Global Namespace)']]], + ['sph_5fneumannl_1438',['sph_neumannl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga3cededa9b6e4601f190c3811e6aabfd6',1,'std::sph_neumannl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga3cededa9b6e4601f190c3811e6aabfd6',1,'sph_neumannl()(Global Namespace)']]], + ['sphericalportraitprojector_1439',['SphericalPortraitProjector',['https://docs.opencv.org/4.2.0/d3/d0d/structcv_1_1detail_1_1SphericalPortraitProjector.html',1,'cv::detail']]], + ['sphericalportraitwarper_1440',['SphericalPortraitWarper',['https://docs.opencv.org/4.2.0/d8/d70/classcv_1_1detail_1_1SphericalPortraitWarper.html',1,'cv::detail::SphericalPortraitWarper'],['https://docs.opencv.org/4.2.0/d8/d70/classcv_1_1detail_1_1SphericalPortraitWarper.html#a28b73656940563a8b942778e0753d81f',1,'cv::detail::SphericalPortraitWarper::SphericalPortraitWarper()']]], + ['sphericalprojector_1441',['SphericalProjector',['https://docs.opencv.org/4.2.0/d0/d88/structcv_1_1detail_1_1SphericalProjector.html',1,'cv::detail']]], + ['sphericalwarper_1442',['SphericalWarper',['https://docs.opencv.org/4.2.0/d6/dd0/classcv_1_1detail_1_1SphericalWarper.html',1,'cv::detail::SphericalWarper'],['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1SphericalWarper.html',1,'cv::SphericalWarper'],['https://docs.opencv.org/4.2.0/d6/dd0/classcv_1_1detail_1_1SphericalWarper.html#a6d5126785c4821d61c3886523749b8ba',1,'cv::detail::SphericalWarper::SphericalWarper()']]], + ['sphericalwarpergpu_1443',['SphericalWarperGpu',['https://docs.opencv.org/4.2.0/db/d09/classcv_1_1detail_1_1SphericalWarperGpu.html',1,'cv::detail::SphericalWarperGpu'],['https://docs.opencv.org/4.2.0/db/d09/classcv_1_1detail_1_1SphericalWarperGpu.html#ad89e6054bd99e985c92a602c4e0c44ea',1,'cv::detail::SphericalWarperGpu::SphericalWarperGpu()']]], + ['spin_1444',['spin',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a26114066f4d49398fb1b98bde3b5dc78',1,'cv::viz::Viz3d']]], + ['spinonce_1445',['spinOnce',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a481d977ad11a63da44ece08e7f76fdef',1,'cv::viz::Viz3d']]], + ['splay_5ffn_5fimps_2ehpp_1446',['splay_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01427.html',1,'']]], + ['splay_5ftree_5f_2ehpp_1447',['splay_tree_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01430.html',1,'']]], + ['splay_5ftree_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_1448',['splay_tree_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16712.html',1,'']]], + ['splay_5ftree_5f_2fdebug_5ffn_5fimps_2ehpp_1449',['splay_tree_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16784.html',1,'']]], + ['splay_5ftree_5f_2ferase_5ffn_5fimps_2ehpp_1450',['splay_tree_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16847.html',1,'']]], + ['splay_5ftree_5f_2ffind_5ffn_5fimps_2ehpp_1451',['splay_tree_/find_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16892.html',1,'']]], + ['splay_5ftree_5f_2finfo_5ffn_5fimps_2ehpp_1452',['splay_tree_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16976.html',1,'']]], + ['splay_5ftree_5f_2finsert_5ffn_5fimps_2ehpp_1453',['splay_tree_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17012.html',1,'']]], + ['splay_5ftree_5f_2fnode_2ehpp_1454',['splay_tree_/node.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17105.html',1,'']]], + ['splay_5ftree_5f_2fsplit_5fjoin_5ffn_5fimps_2ehpp_1455',['splay_tree_/split_join_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17255.html',1,'']]], + ['splay_5ftree_5f_2ftraits_2ehpp_1456',['splay_tree_/traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17321.html',1,'']]], + ['splay_5ftree_5fmap_1457',['splay_tree_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12027.html',1,'__gnu_pbds::detail']]], + ['splay_5ftree_5fnode_5f_1458',['splay_tree_node_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12019.html',1,'__gnu_pbds::detail']]], + ['splay_5ftree_5ftag_1459',['splay_tree_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11247.html',1,'__gnu_pbds']]], + ['splice_1460',['splice',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a2fe50f31cf743a71040ad740b7d1609c',1,'cv::Subdiv2D::splice()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ae27f8110bc96c70775f1654e978b4c5f',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a11428bfeda40f933f26428bf432907db',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &&__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa9275ed20653d145bd3c324e0b0422c3',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa4a9d0e45f35bc5c51ee5b1646304bb6',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &&__x, const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a5e2e8e3c78743063a5223b09a7f7abf6',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &__x, const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ae27f8110bc96c70775f1654e978b4c5f',1,'std::list::splice(const_iterator __position, list &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a11428bfeda40f933f26428bf432907db',1,'std::list::splice(const_iterator __position, list &&__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa9275ed20653d145bd3c324e0b0422c3',1,'std::list::splice(const_iterator __position, list &__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa4a9d0e45f35bc5c51ee5b1646304bb6',1,'std::list::splice(const_iterator __position, list &&__x, const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a5e2e8e3c78743063a5223b09a7f7abf6',1,'std::list::splice(const_iterator __position, list &__x, const_iterator __first, const_iterator __last) noexcept']]], + ['splice_5fafter_1461',['splice_after',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a8918bd7e48f28df3b891edfc246556d0',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&__list) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aa3a2a989959206263a683014f575cdc3',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&__list, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a9c1efa0c819d46d9d19f7fc363e14307',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&, const_iterator __before, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac9ba3ce45ccc225252b0a7b14e883dcc',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &, const_iterator __before, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a9c1efa0c819d46d9d19f7fc363e14307',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&, const_iterator __before, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac9ba3ce45ccc225252b0a7b14e883dcc',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &, const_iterator __before, const_iterator __last) noexcept']]], + ['splines_5fmodule_1462',['Splines_Module',['https://eigen.tuxfamily.org/dox/group__Splines__Module.html',1,'']]], + ['split_1463',['Split',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html',1,'cv::ml::DTrees::Split'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#aa25a57fa40ee868d39b50f4488cac462',1,'cv::ml::DTrees::Split::Split()']]], + ['split_1464',['split',['https://docs.opencv.org/4.2.0/df/df2/group__core__hal__interface__split.html',1,'Channel split'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#a39f10fb90b1ef7af76ee854c9214c5dc',1,'cv::ml::DTrees::Node::split'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0547c7fed86152d7e9d0096029c8518a',1,'cv::split(const Mat &src, Mat *mvbegin)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8027f9deee1e42716be8039e5863fbd9',1,'cv::split(InputArray m, OutputArrayOfArrays mv)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gabe5013d55d4ff586b20393913726179e',1,'cv::cuda::split(InputArray src, GpuMat *dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaf1714e7a9ea0719c29bf378beaf5f99d',1,'cv::cuda::split(InputArray src, std::vector< GpuMat > &dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html#gab5a8449f94bf741fb2b0a4f59ce1c81c',1,'cv::datasets::split()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0547c7fed86152d7e9d0096029c8518a',1,'split(const Mat &src, Mat *mvbegin)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8027f9deee1e42716be8039e5863fbd9',1,'split(InputArray m, OutputArrayOfArrays mv)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gabe5013d55d4ff586b20393913726179e',1,'split(InputArray src, GpuMat *dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaf1714e7a9ea0719c29bf378beaf5f99d',1,'split(InputArray src, std::vector< GpuMat > &dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html#gab5a8449f94bf741fb2b0a4f59ce1c81c',1,'split(const std::string &s, std::vector< std::string > &elems, char delim)(Global Namespace)']]], + ['split16u_1465',['split16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8cd402bcaf735ab84d5ad59051868add',1,'cv::hal::split16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8cd402bcaf735ab84d5ad59051868add',1,'split16u()(Global Namespace)']]], + ['split3_1466',['split3',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gabfeb794ff284b18121b2b755a5391892',1,'cv::gapi::split3()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gabfeb794ff284b18121b2b755a5391892',1,'split3()(Global Namespace)']]], + ['split32s_1467',['split32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfc4896c02badd30b7bba240188c684c',1,'cv::hal::split32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfc4896c02badd30b7bba240188c684c',1,'split32s()(Global Namespace)']]], + ['split4_1468',['split4',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gac87c9e2894c8b589eabc0ec2ac9d90eb',1,'cv::gapi::split4()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gac87c9e2894c8b589eabc0ec2ac9d90eb',1,'split4()(Global Namespace)']]], + ['split64s_1469',['split64s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac1622b7541f3084a053e12e0419bd88f',1,'cv::hal::split64s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac1622b7541f3084a053e12e0419bd88f',1,'split64s()(Global Namespace)']]], + ['split8u_1470',['split8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a989ec41345fcd2e66cc809fa9a4cb4',1,'cv::hal::split8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a989ec41345fcd2e66cc809fa9a4cb4',1,'split8u()(Global Namespace)']]], + ['split_5fcoeff_1471',['split_coeff',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a884c68fdde1552ace3e6f7a2e2452254',1,'cv::TrackerKCF::Params']]], + ['split_5ffn_5fimps_2ehpp_1472',['split_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01382.html',1,'']]], + ['split_5fjoin_5fcan_5fthrow_1473',['split_join_can_throw',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html#ace925c8be06b3640abb7b6f486290daba065162f99ac47cfa946b17a85f2e5f1e',1,'__gnu_pbds::container_traits']]], + ['split_5fmerge_2ehpp_1474',['split_merge.hpp',['https://docs.opencv.org/4.2.0/d6/d56/split__merge_8hpp.html',1,'']]], + ['splitlayer_1475',['SplitLayer',['https://docs.opencv.org/4.2.0/dd/df9/classcv_1_1dnn_1_1SplitLayer.html',1,'cv::dnn']]], + ['spointinoctavex_1476',['sPointInOctaveX',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#aadf42087a0908a900d34d9396037dc28',1,'cv::line_descriptor::KeyLine']]], + ['spointinoctavey_1477',['sPointInOctaveY',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a4d7fb8e09d606597d0af5a0df7e72087',1,'cv::line_descriptor::KeyLine']]], + ['spqr_1478',['SPQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html',1,'Eigen']]], + ['sputbackc_1479',['sputbackc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'__gnu_cxx::enc_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'__gnu_cxx::stdio_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'__gnu_cxx::stdio_sync_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_filebuf< char_type, traits_type >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_streambuf< _Elem, _Tr >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_streambuf< char, _Traits >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_streambuf< char, char_traits< char > >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::basic_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::basic_streambuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::basic_stringbuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::wbuffer_convert::sputbackc()']]], + ['sputc_1480',['sputc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'__gnu_cxx::enc_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'__gnu_cxx::stdio_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'__gnu_cxx::stdio_sync_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_filebuf< char_type, traits_type >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_streambuf< _Elem, _Tr >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_streambuf< char, _Traits >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_streambuf< char, char_traits< char > >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::basic_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::basic_streambuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::basic_stringbuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::wbuffer_convert::sputc()']]], + ['sputn_1481',['sputn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'__gnu_cxx::enc_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'__gnu_cxx::stdio_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'__gnu_cxx::stdio_sync_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_filebuf< char_type, traits_type >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_streambuf< _Elem, _Tr >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_streambuf< char, _Traits >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_streambuf< char, char_traits< char > >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::basic_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::basic_streambuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::basic_stringbuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::wbuffer_convert::sputn()']]], + ['sqr_1482',['sqr',['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1reg_1_1Mapper.html#a8905f76c21eff065d468bb63818f5f20',1,'cv::reg::Mapper::sqr()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga8aae233da90ce0ffe309ab8004342acb',1,'cv::cuda::sqr()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga8aae233da90ce0ffe309ab8004342acb',1,'sqr()(Global Namespace)']]], + ['sqr_5f_1483',['sqr_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb27ca55e895037b8a5f57d3f6b83fb9',1,'cv::cudev::sqr_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb27ca55e895037b8a5f57d3f6b83fb9',1,'sqr_()(Global Namespace)']]], + ['sqr_5ffunc_1484',['sqr_func',['https://docs.opencv.org/4.2.0/d9/d1d/structcv_1_1cudev_1_1sqr__func.html',1,'cv::cudev']]], + ['sqrboxfilter_1485',['sqrBoxFilter',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga76e863e7869912edbe88321253b72688',1,'cv::sqrBoxFilter()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga76e863e7869912edbe88321253b72688',1,'sqrBoxFilter()(Global Namespace)']]], + ['sqrintegral_1486',['sqrIntegral',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga40c75196202706399a60bf6ba7a052ac',1,'cv::cuda::sqrIntegral()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga40c75196202706399a60bf6ba7a052ac',1,'sqrIntegral()(Global Namespace)']]], + ['sqrsum_1487',['sqrSum',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga056c804ebf5d2eb9f6f35e3dcb01524c',1,'cv::cuda::sqrSum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga056c804ebf5d2eb9f6f35e3dcb01524c',1,'sqrSum()(Global Namespace)']]], + ['sqrt_1488',['sqrt',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad873dca860bd47baeeede8663e161b83',1,'Eigen::MatrixBase::sqrt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad873dca860bd47baeeede8663e161b83',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sqrt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad873dca860bd47baeeede8663e161b83',1,'MatrixBase< Solve< Decomposition, RhsType > >::sqrt()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga682082a1892db64a2856403ec17ba297',1,'cv::sqrt(const softfloat &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga021a8c75426f99035d767a68d258e12a',1,'cv::sqrt(const softdouble &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga186222c3919657890f88df5a1f64a7d7',1,'cv::sqrt(InputArray src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga09303680cb1a5521a922b6d392028d8c',1,'cv::cuda::sqrt()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc50a964cceb2c66902a54c327103421',1,'cv::cudev::sqrt(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e7258a055c96158790a168f7f80a97f',1,'cv::cudev::sqrt(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5636d655b66d1e528679dca9099cd0fa',1,'cv::cudev::sqrt(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb80681acb72738ed818f3f2d46b3fa2',1,'cv::cudev::sqrt(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5004527b61c574319714c7cef27adaf',1,'cv::cudev::sqrt(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga922fe16de9a9337ce89c38529cbf4bc2',1,'cv::cudev::sqrt(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f5651c2f477deab8c9a6a22480b0921',1,'cv::cudev::sqrt(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24082b6cad8f2ce48a688416553d4cee',1,'cv::cudev::sqrt(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa976ce20aaa72db500831bf5f7b07573',1,'cv::cudev::sqrt(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14bd8e08e3ed7e7eb27d443b7f561d99',1,'cv::cudev::sqrt(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37cd9743de393cb069367eb6eacfbd47',1,'cv::cudev::sqrt(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb4bf19688d464f9ca6762dcc5052764',1,'cv::cudev::sqrt(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0a7f7fea0c50ddf540b5e4d2652eb59',1,'cv::cudev::sqrt(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabca1ecf48e0d7efa0ef3a267169af3e9',1,'cv::cudev::sqrt(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546317b5fabb8dba6e03c186b29de6e',1,'cv::cudev::sqrt(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b7b4319ad51d28aa241f421d918a106',1,'cv::cudev::sqrt(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5445817fdef24e8f63fe154b3e0ff1db',1,'cv::cudev::sqrt(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf088d5ce5e1a99b65a2e563a1212985',1,'cv::cudev::sqrt(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bac73eee164c074617d7542a0328dff',1,'cv::cudev::sqrt(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf838bdac0e861508a4706edd78f2ff7e',1,'cv::cudev::sqrt(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf5cd21194f2cbaeaada72747bf04a0',1,'cv::cudev::sqrt(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79b759ff3cc2ae788b7cd28876b8f32f',1,'cv::cudev::sqrt(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c295b136a0161bcffd91a1b872b5e6d',1,'cv::cudev::sqrt(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8915709c6046b1de839b156c6a3e2fbd',1,'cv::cudev::sqrt(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadef80c222abf27a9e99b5dd50b6dd911',1,'cv::cudev::sqrt(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fdf1eb5d63c4bd6c0e9aa3826df4c56',1,'cv::cudev::sqrt(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819167f65c834bcb0aff3c93dbc3c6ff',1,'cv::cudev::sqrt(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dec14a6c836fe321ee6d34e43bcf63',1,'cv::cudev::sqrt(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc7ad959ab6a8987b12e7d5f74549864',1,'cv::cudev::sqrt(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf48bb6b8b4f2ec9160f153e00d413071',1,'cv::cudev::sqrt(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00f30f8a2dd3b6e7b2b423f4c77c5e88',1,'cv::cudev::sqrt(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6893715da72b11485bce57fc081add6',1,'cv::cudev::sqrt(const double3 &a)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaf3880c8feae9027fa91a701a1fd0d3b4',1,'cv::gapi::sqrt()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga186222c3919657890f88df5a1f64a7d7',1,'sqrt(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga682082a1892db64a2856403ec17ba297',1,'sqrt(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga021a8c75426f99035d767a68d258e12a',1,'sqrt(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaf3880c8feae9027fa91a701a1fd0d3b4',1,'sqrt(const GMat &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga09303680cb1a5521a922b6d392028d8c',1,'sqrt(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc50a964cceb2c66902a54c327103421',1,'sqrt(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e7258a055c96158790a168f7f80a97f',1,'sqrt(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5636d655b66d1e528679dca9099cd0fa',1,'sqrt(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb80681acb72738ed818f3f2d46b3fa2',1,'sqrt(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5004527b61c574319714c7cef27adaf',1,'sqrt(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga922fe16de9a9337ce89c38529cbf4bc2',1,'sqrt(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f5651c2f477deab8c9a6a22480b0921',1,'sqrt(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24082b6cad8f2ce48a688416553d4cee',1,'sqrt(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa976ce20aaa72db500831bf5f7b07573',1,'sqrt(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14bd8e08e3ed7e7eb27d443b7f561d99',1,'sqrt(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37cd9743de393cb069367eb6eacfbd47',1,'sqrt(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb4bf19688d464f9ca6762dcc5052764',1,'sqrt(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0a7f7fea0c50ddf540b5e4d2652eb59',1,'sqrt(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabca1ecf48e0d7efa0ef3a267169af3e9',1,'sqrt(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546317b5fabb8dba6e03c186b29de6e',1,'sqrt(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b7b4319ad51d28aa241f421d918a106',1,'sqrt(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5445817fdef24e8f63fe154b3e0ff1db',1,'sqrt(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf088d5ce5e1a99b65a2e563a1212985',1,'sqrt(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bac73eee164c074617d7542a0328dff',1,'sqrt(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf838bdac0e861508a4706edd78f2ff7e',1,'sqrt(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf5cd21194f2cbaeaada72747bf04a0',1,'sqrt(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79b759ff3cc2ae788b7cd28876b8f32f',1,'sqrt(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c295b136a0161bcffd91a1b872b5e6d',1,'sqrt(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8915709c6046b1de839b156c6a3e2fbd',1,'sqrt(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadef80c222abf27a9e99b5dd50b6dd911',1,'sqrt(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fdf1eb5d63c4bd6c0e9aa3826df4c56',1,'sqrt(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819167f65c834bcb0aff3c93dbc3c6ff',1,'sqrt(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dec14a6c836fe321ee6d34e43bcf63',1,'sqrt(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc7ad959ab6a8987b12e7d5f74549864',1,'sqrt(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf48bb6b8b4f2ec9160f153e00d413071',1,'sqrt(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00f30f8a2dd3b6e7b2b423f4c77c5e88',1,'sqrt(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6893715da72b11485bce57fc081add6',1,'sqrt(const double3 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf91cd3409ab242d469bcc1b2d06624c3',1,'std::sqrt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf91cd3409ab242d469bcc1b2d06624c3',1,'sqrt()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af4f536e8ea56702e63088efb3706d1f0',1,'Eigen::sqrt()']]], + ['sqrt32f_1489',['sqrt32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga99f1449955e5dd00966f4e37fbf72027',1,'cv::hal::sqrt32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga99f1449955e5dd00966f4e37fbf72027',1,'sqrt32f()(Global Namespace)']]], + ['sqrt64f_1490',['sqrt64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2343231151ea0b652a3aa38f0b57b9e1',1,'cv::hal::sqrt64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2343231151ea0b652a3aa38f0b57b9e1',1,'sqrt64f()(Global Namespace)']]], + ['sqrt_5f_1491',['sqrt_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa26d03e4b54bae8b41de6946e64583',1,'cv::cudev::sqrt_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa26d03e4b54bae8b41de6946e64583',1,'sqrt_()(Global Namespace)']]], + ['sqrt_5ffunc_1492',['sqrt_func',['https://docs.opencv.org/4.2.0/d9/d47/structcv_1_1cudev_1_1sqrt__func.html',1,'cv::cudev']]], + ['sqrt_5ffunc_3c_20double_20_3e_1493',['sqrt_func< double >',['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1cudev_1_1sqrt__func_3_01double_01_4.html',1,'cv::cudev']]], + ['sqrt_5ffunc_3c_20float_20_3e_1494',['sqrt_func< float >',['https://docs.opencv.org/4.2.0/d8/dd2/structcv_1_1cudev_1_1sqrt__func_3_01float_01_4.html',1,'cv::cudev']]], + ['sqrt_5ffunc_3c_20schar_20_3e_1495',['sqrt_func< schar >',['https://docs.opencv.org/4.2.0/da/d64/structcv_1_1cudev_1_1sqrt__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['sqrt_5ffunc_3c_20short_20_3e_1496',['sqrt_func< short >',['https://docs.opencv.org/4.2.0/d2/d6a/structcv_1_1cudev_1_1sqrt__func_3_01short_01_4.html',1,'cv::cudev']]], + ['sqrt_5ffunc_3c_20uchar_20_3e_1497',['sqrt_func< uchar >',['https://docs.opencv.org/4.2.0/d9/d33/structcv_1_1cudev_1_1sqrt__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['sqrt_5ffunc_3c_20uint_20_3e_1498',['sqrt_func< uint >',['https://docs.opencv.org/4.2.0/d0/d7b/structcv_1_1cudev_1_1sqrt__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['sqrt_5ffunc_3c_20ushort_20_3e_1499',['sqrt_func< ushort >',['https://docs.opencv.org/4.2.0/df/df4/structcv_1_1cudev_1_1sqrt__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['square_1500',['square',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af28ef8cae3b37bcf1b47910cd6f20d4c',1,'Eigen']]], + ['square_20chessboard_1501',['Camera calibration with square chessboard',['https://docs.opencv.org/4.2.0/dc/d43/tutorial_camera_calibration_square_chess.html',1,'']]], + ['square_20root_20calculation_1502',['Square root calculation',['https://docs.opencv.org/4.2.0/d5/dc3/group__core__hal__interface__sqrt.html',1,'']]], + ['square_20root_20calculation_1503',['Inverse square root calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'']]], + ['squareddistance_1504',['squaredDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a5cb6544a7fff4c3571c0a5eb82eec8bb',1,'Eigen::ParametrizedLine']]], + ['squaredexteriordistance_1505',['squaredExteriorDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#aa91643da79398e454618ad06b92ff531',1,'Eigen::AlignedBox::squaredExteriorDistance(const AlignedBox &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a845dd8a069c204d15f12aa2702dd9539',1,'Eigen::AlignedBox::squaredExteriorDistance(const MatrixBase< Derived > &p) const']]], + ['squarednorm_1506',['squaredNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac8da566526419f9742a6c471bbd87e0a',1,'Eigen::MatrixBase::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac8da566526419f9742a6c471bbd87e0a',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac8da566526419f9742a6c471bbd87e0a',1,'MatrixBase< Solve< Decomposition, RhsType > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'Eigen::QuaternionBase::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'Eigen::VectorwiseOp::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Derived, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Derived, Vertical >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::squaredNorm()']]], + ['squares_20systems_1507',['Solving linear least squares systems',['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'']]], + ['squaresize_1508',['squareSize',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#aa2538d0677c62ce5ab7b5c0569c1afba',1,'cv::CirclesGridFinderParameters']]], + ['sr_5fbenchmark_2emarkdown_1509',['sr_benchmark.markdown',['https://docs.opencv.org/4.2.0/d0/d3b/sr__benchmark_8markdown.html',1,'']]], + ['sr_5fbsds_1510',['SR_bsds',['https://docs.opencv.org/4.2.0/d6/d05/classcv_1_1datasets_1_1SR__bsds.html',1,'cv::datasets']]], + ['sr_5fbsds_2ehpp_1511',['sr_bsds.hpp',['https://docs.opencv.org/4.2.0/d2/d03/sr__bsds_8hpp.html',1,'']]], + ['sr_5fbsdsobj_1512',['SR_bsdsObj',['https://docs.opencv.org/4.2.0/dc/d1e/structcv_1_1datasets_1_1SR__bsdsObj.html',1,'cv::datasets']]], + ['sr_5fcross_1513',['SR_CROSS',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggabd57af723cddf921d0c0601a6e8e789ba9d59164b49e3adbe1031a21d65053edb',1,'cv::optflow::SR_CROSS'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggabd57af723cddf921d0c0601a6e8e789ba9d59164b49e3adbe1031a21d65053edb',1,'SR_CROSS(Global Namespace)']]], + ['sr_5fdiv2k_1514',['SR_div2k',['https://docs.opencv.org/4.2.0/d2/db5/classcv_1_1datasets_1_1SR__div2k.html',1,'cv::datasets']]], + ['sr_5fdiv2k_2ehpp_1515',['sr_div2k.hpp',['https://docs.opencv.org/4.2.0/db/d8f/sr__div2k_8hpp.html',1,'']]], + ['sr_5fdiv2kobj_1516',['SR_div2kObj',['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1datasets_1_1SR__div2kObj.html',1,'cv::datasets']]], + ['sr_5ffixed_1517',['SR_FIXED',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggabd57af723cddf921d0c0601a6e8e789ba039f4856c9cd55fdd1a50c20885f046b',1,'cv::optflow::SR_FIXED'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggabd57af723cddf921d0c0601a6e8e789ba039f4856c9cd55fdd1a50c20885f046b',1,'SR_FIXED(Global Namespace)']]], + ['sr_5fgeneral100_1518',['SR_general100',['https://docs.opencv.org/4.2.0/d5/d19/classcv_1_1datasets_1_1SR__general100.html',1,'cv::datasets']]], + ['sr_5fgeneral100_2ehpp_1519',['sr_general100.hpp',['https://docs.opencv.org/4.2.0/d4/d6b/sr__general100_8hpp.html',1,'']]], + ['sr_5fgeneral100obj_1520',['SR_general100Obj',['https://docs.opencv.org/4.2.0/da/dad/structcv_1_1datasets_1_1SR__general100Obj.html',1,'cv::datasets']]], + ['src_1521',['src',['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#ad8f380e5494fafe97dc049e4c416a2d0',1,'cv::cudev::BrdBase::src'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#a0e461dcbe6609290f44f0dd0cfdfe014',1,'cv::cudev::BrdConstant::src'],['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#a28a7a5450092bac2259f9e70fd5a74d1',1,'cv::cudev::CommonAreaInterPtr::src'],['https://docs.opencv.org/4.2.0/dd/d49/structcv_1_1cudev_1_1CountNonZeroExprBody.html#afe56646189c220ebc5d8e726067af322',1,'cv::cudev::CountNonZeroExprBody::src'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1CubicInterPtr.html#ac52c1728bef16b9b5fc5d76b5fa33325',1,'cv::cudev::CubicInterPtr::src'],['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1cudev_1_1DerivXPtr.html#a0c246f64f78809e0c62df773b4333966',1,'cv::cudev::DerivXPtr::src'],['https://docs.opencv.org/4.2.0/dc/d51/structcv_1_1cudev_1_1DerivYPtr.html#aa1e78c23ab24dcb531bc1d4f8b1298db',1,'cv::cudev::DerivYPtr::src'],['https://docs.opencv.org/4.2.0/d9/d48/structcv_1_1cudev_1_1FindMaxValExprBody.html#abe30e0e2659e3bb8fe34c95f06fea1db',1,'cv::cudev::FindMaxValExprBody::src'],['https://docs.opencv.org/4.2.0/dd/db3/structcv_1_1cudev_1_1FindMinMaxValExprBody.html#a27b8cc71a6d60bb5f7cf96ac537302aa',1,'cv::cudev::FindMinMaxValExprBody::src'],['https://docs.opencv.org/4.2.0/df/d82/structcv_1_1cudev_1_1FindMinValExprBody.html#ac65c776d8fe0e31840e4a1adc7b85828',1,'cv::cudev::FindMinValExprBody::src'],['https://docs.opencv.org/4.2.0/d9/dea/structcv_1_1cudev_1_1HistogramBody.html#a835b34b72a6e8cc23c2c9a6f400a6713',1,'cv::cudev::HistogramBody::src'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#a4bbe7a71b855ad501e2094559d58b6c6',1,'cv::cudev::IntegerAreaInterPtr::src'],['https://docs.opencv.org/4.2.0/d3/dde/structcv_1_1cudev_1_1IntegralBody.html#ab9411704ac319d52eed01b35cdc2a298',1,'cv::cudev::IntegralBody::src'],['https://docs.opencv.org/4.2.0/d0/de6/structcv_1_1cudev_1_1LaplacianPtr_3_011_00_01SrcPtr_01_4.html#a5d3403e2a9f0bf0884a715e4224fa1e9',1,'cv::cudev::LaplacianPtr< 1, SrcPtr >::src'],['https://docs.opencv.org/4.2.0/d4/d89/structcv_1_1cudev_1_1LaplacianPtr_3_013_00_01SrcPtr_01_4.html#a33991dc92063cf0e67005497b259e93c',1,'cv::cudev::LaplacianPtr< 3, SrcPtr >::src'],['https://docs.opencv.org/4.2.0/d7/d8a/structcv_1_1cudev_1_1LinearInterPtr.html#a803c0787533b510decf2ff784d6658c0',1,'cv::cudev::LinearInterPtr::src'],['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html#a57c863b2fef18a0496ce850f595e6573',1,'cv::cudev::LutPtr::src'],['https://docs.opencv.org/4.2.0/d0/df5/structcv_1_1cudev_1_1NearestInterPtr.html#a846c935d96545401f78d7505059df913',1,'cv::cudev::NearestInterPtr::src'],['https://docs.opencv.org/4.2.0/d1/d8a/structcv_1_1cudev_1_1PyrDownBody.html#a4475b1f0b499cfd4ca2b2fdb46818998',1,'cv::cudev::PyrDownBody::src'],['https://docs.opencv.org/4.2.0/d1/de8/structcv_1_1cudev_1_1PyrUpBody.html#ad8fbeac8f5d64ac603e122efc4183616',1,'cv::cudev::PyrUpBody::src'],['https://docs.opencv.org/4.2.0/d5/df4/structcv_1_1cudev_1_1ReduceToColumnBody.html#aa72b57549923cafbecfcb80c3d3849bd',1,'cv::cudev::ReduceToColumnBody::src'],['https://docs.opencv.org/4.2.0/da/d58/structcv_1_1cudev_1_1ReduceToRowBody.html#ae6544f765538d7a70af86a0c6c9b226e',1,'cv::cudev::ReduceToRowBody::src'],['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html#a1bb3834387ca5de2f8203beb166d26b3',1,'cv::cudev::RemapPtr1::src'],['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#ab2019553ffaaa44a94da9bcb69317fce',1,'cv::cudev::RemapPtr2::src'],['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#a74b6f1bae461e40b5bcd751b5802a219',1,'cv::cudev::ResizePtr::src'],['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1ScharrXPtr.html#a9fc7f2466fbe547c1eda7c466d513128',1,'cv::cudev::ScharrXPtr::src'],['https://docs.opencv.org/4.2.0/d0/d70/structcv_1_1cudev_1_1ScharrYPtr.html#ace8f6213d3a601a401acea4dd2f7e5db',1,'cv::cudev::ScharrYPtr::src'],['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1SobelXPtr.html#aa965d2eb5adc35fa068158328ddae626',1,'cv::cudev::SobelXPtr::src'],['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1SobelYPtr.html#a332a972a71fc04af4791d58a1e00ad14',1,'cv::cudev::SobelYPtr::src'],['https://docs.opencv.org/4.2.0/dd/d33/structcv_1_1cudev_1_1SumExprBody.html#ab272adfc6687ba7156bc914238f79299',1,'cv::cudev::SumExprBody::src'],['https://docs.opencv.org/4.2.0/d2/d40/structcv_1_1cudev_1_1TransposeBody.html#a18b80215a5fde29be9e39153fb1699a4',1,'cv::cudev::TransposeBody::src'],['https://docs.opencv.org/4.2.0/dd/d01/structcv_1_1cudev_1_1UnaryTransformPtr.html#aaa7399d4841ac33ec7469c162753e97c',1,'cv::cudev::UnaryTransformPtr::src']]], + ['src1_1522',['src1',['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#a7b2d04ddb90892992ece567566b0bebf',1,'cv::cudev::BinaryTransformPtr']]], + ['src2_1523',['src2',['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#a5f65cb3b9fc7d2216dc6951294545989',1,'cv::cudev::BinaryTransformPtr']]], + ['src_5fimg_5fidx_1524',['src_img_idx',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#a3b89533af56dcc765e0f826a056b0c1f',1,'cv::detail::MatchesInfo']]], + ['srcbw_1525',['srcBw',['https://docs.opencv.org/4.2.0/d8/d65/structcv_1_1datasets_1_1IS__weizmannObj.html#aaa10679fcb8ecda4305025192c6b90e7',1,'cv::datasets::IS_weizmannObj']]], + ['srccolor_1526',['srcColor',['https://docs.opencv.org/4.2.0/d8/d65/structcv_1_1datasets_1_1IS__weizmannObj.html#a984317c8df2da404c1d50856948bf816',1,'cv::datasets::IS_weizmannObj']]], + ['sregex_5ftoken_5fiterator_1527',['sregex_token_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa39e71a0a921a1f5b6e106613346195c',1,'std::sregex_token_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa39e71a0a921a1f5b6e106613346195c',1,'sregex_token_iterator(Global Namespace)']]], + ['sse_20utilities_1528',['SSE utilities',['https://docs.opencv.org/4.2.0/d6/d06/group__core__utils__sse.html',1,'']]], + ['sse_5futils_2ehpp_1529',['sse_utils.hpp',['https://docs.opencv.org/4.2.0/d2/d0d/sse__utils_8hpp.html',1,'']]], + ['ssim_20on_20the_20gpu_1530',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], + ['sso_5fstring_5fbase_2eh_1531',['sso_string_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01082.html',1,'']]], + ['sstream_1532',['sstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00140.html',1,'']]], + ['sstream_2etcc_1533',['sstream.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00518.html',1,'']]], + ['ssub_5fmatch_1534',['ssub_match',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1339fbccc0b05ed8cfe8c3afa83e9a4b',1,'std::ssub_match'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1339fbccc0b05ed8cfe8c3afa83e9a4b',1,'ssub_match(Global Namespace)']]], + ['st_5fbilinear_1535',['ST_BILINEAR',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggaac4a33e26da30a5c5aa1ed3f66fc0998a412f292ae2101f5fd3de778cc597c13c',1,'cv::optflow::ST_BILINEAR'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggaac4a33e26da30a5c5aa1ed3f66fc0998a412f292ae2101f5fd3de778cc597c13c',1,'ST_BILINEAR(Global Namespace)']]], + ['st_5fstandart_1536',['ST_STANDART',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggaac4a33e26da30a5c5aa1ed3f66fc0998aa4c47a58f231a484eff77183148908a2',1,'cv::optflow::ST_STANDART'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ggaac4a33e26da30a5c5aa1ed3f66fc0998aa4c47a58f231a484eff77183148908a2',1,'ST_STANDART(Global Namespace)']]], + ['stabilization_1537',['Video Stabilization',['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html',1,'']]], + ['stabilizationmotions_1538',['stabilizationMotions',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a43591cd4c8e8a8efa749950adc86697c',1,'cv::videostab::InpainterBase::stabilizationMotions()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a24db866bac68dab9e8684a6df9b68638',1,'cv::videostab::WobbleSuppressorBase::stabilizationMotions()']]], + ['stabilizationmotions_5f_1539',['stabilizationMotions_',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#ab778e2b654dbd54e36bb0aea388914ef',1,'cv::videostab::InpainterBase::stabilizationMotions_'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aeb86f1064652cceb6f9a1735a81da5af',1,'cv::videostab::StabilizerBase::stabilizationMotions_'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#aab16261a43fe5585cff7e2dc0b26e161',1,'cv::videostab::WobbleSuppressorBase::stabilizationMotions_']]], + ['stabilize_1540',['stabilize',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1videostab_1_1GaussianMotionFilter.html#a0549d542dcf377187cdd00b9c6fd72db',1,'cv::videostab::GaussianMotionFilter::stabilize()'],['https://docs.opencv.org/4.2.0/d0/df6/classcv_1_1videostab_1_1IMotionStabilizer.html#a5a2e7cd903bf6297e6775a60a8bcf641',1,'cv::videostab::IMotionStabilizer::stabilize()'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a84553c7288378145589c97bb5a9125fe',1,'cv::videostab::LpMotionStabilizer::stabilize()'],['https://docs.opencv.org/4.2.0/dd/df4/classcv_1_1videostab_1_1MotionFilterBase.html#a6bcb77ecfd36ed88cc494b953596ce4e',1,'cv::videostab::MotionFilterBase::stabilize(int idx, const std::vector< Mat > &motions, std::pair< int, int > range)=0'],['https://docs.opencv.org/4.2.0/dd/df4/classcv_1_1videostab_1_1MotionFilterBase.html#acbf3a7e9245d79966ba7691bcb67fd11',1,'cv::videostab::MotionFilterBase::stabilize(int size, const std::vector< Mat > &motions, std::pair< int, int > range, Mat *stabilizationMotions) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d9/d76/classcv_1_1videostab_1_1MotionStabilizationPipeline.html#a3f4d3891b05955cd17d213dfcbca9ba1',1,'cv::videostab::MotionStabilizationPipeline::stabilize()']]], + ['stabilizedframes_1541',['stabilizedFrames',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#ab485476a24a32bcf7aaae31ce5669cb0',1,'cv::videostab::InpainterBase']]], + ['stabilizedframes_5f_1542',['stabilizedFrames_',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a83e696d92ba2329bec22047f9298f2fb',1,'cv::videostab::InpainterBase::stabilizedFrames_'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#afbf3e2dd807b19647b545585cf0dbd3e',1,'cv::videostab::StabilizerBase::stabilizedFrames_']]], + ['stabilizedmasks_5f_1543',['stabilizedMasks_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ac77d036c0a94ca9b34ae8f8c69ac220d',1,'cv::videostab::StabilizerBase']]], + ['stabilizeframe_1544',['stabilizeFrame',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aff4ee85e72d58fb3eb09c0f5c8a9314c',1,'cv::videostab::StabilizerBase']]], + ['stabilizer_2ehpp_1545',['stabilizer.hpp',['https://docs.opencv.org/4.2.0/da/dde/stabilizer_8hpp.html',1,'']]], + ['stabilizerbase_1546',['StabilizerBase',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html',1,'cv::videostab::StabilizerBase'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aac79382ab3f87247ddc01fe0aa86ea64',1,'cv::videostab::StabilizerBase::StabilizerBase()']]], + ['stable_5fpartition_1547',['stable_partition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga4396b91f26c7aaf0ae150a79ebd965b7',1,'std::stable_partition()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga4396b91f26c7aaf0ae150a79ebd965b7',1,'stable_partition()(Global Namespace)']]], + ['stable_5fsort_1548',['stable_sort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7d8bb8e52b7b0e80301dcbec17225b4a',1,'std::stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a3ce3aa8ac2297f8290939a7988596d',1,'std::stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7d8bb8e52b7b0e80301dcbec17225b4a',1,'stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a3ce3aa8ac2297f8290939a7988596d',1,'stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], + ['stablenorm_1549',['stableNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab84d3e64f855813b1eea4202c0697dc1',1,'Eigen::MatrixBase::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab84d3e64f855813b1eea4202c0697dc1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab84d3e64f855813b1eea4202c0697dc1',1,'MatrixBase< Solve< Decomposition, RhsType > >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'Eigen::VectorwiseOp::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Derived, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Derived, Vertical >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::stableNorm()']]], + ['stablenormalize_1550',['stableNormalize',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0b1443fa322615379557ade3399a3c3c',1,'Eigen::MatrixBase::stableNormalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0b1443fa322615379557ade3399a3c3c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::stableNormalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0b1443fa322615379557ade3399a3c3c',1,'MatrixBase< Solve< Decomposition, RhsType > >::stableNormalize()']]], + ['stablenormalized_1551',['stableNormalized',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a399dca938633b9f8df5ec4beefeccec0',1,'Eigen::MatrixBase::stableNormalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a399dca938633b9f8df5ec4beefeccec0',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::stableNormalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a399dca938633b9f8df5ec4beefeccec0',1,'MatrixBase< Solve< Decomposition, RhsType > >::stableNormalized()']]], + ['stack_1552',['stack',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html',1,'std::stack< _Tp, _Sequence >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00143.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#ad95ef4166cdb0aa8bae1dcd7ae2839e4',1,'stack< _StateSeqT >::stack()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#ad95ef4166cdb0aa8bae1dcd7ae2839e4',1,'std::stack::stack()']]], + ['stack_20alignment_1553',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], + ['stack_3c_20_5fstateseqt_20_3e_1554',['stack< _StateSeqT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html',1,'']]], + ['stages_5fn_1555',['stages_n',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a63cbf9168f863178bba4e2eaddf79ac0',1,'cv::face::FacemarkLBF::Params']]], + ['standard_20backends_1556',['G-API Standard Backends',['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html',1,'']]], + ['standard_5fpolicies_2ehpp_1557',['standard_policies.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01151.html',1,'']]], + ['standardcollector_1558',['StandardCollector',['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html',1,'cv::face::StandardCollector'],['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#a24e397f05bbfaa973ab519d000e559c6',1,'cv::face::StandardCollector::StandardCollector()']]], + ['standardcompressedformat_1559',['StandardCompressedFormat',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a4b73fd62205603cef3ab78a3e66c5941abd3632507a3697fb48c77eff79851a74',1,'Eigen']]], + ['starcensustransform_1560',['starCensusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6e3b6dac980497890a61871f3ad90ecb',1,'cv::stereo::starCensusTransform(const cv::Mat &img1, const cv::Mat &img2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2)'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#af1ad2e7309e42a42e92d65e13bb526ff',1,'cv::stereo::starCensusTransform(const cv::Mat &img1, int kernelSize, cv::Mat &dist)']]], + ['stardetector_1561',['StarDetector',['https://docs.opencv.org/4.2.0/dd/d39/classcv_1_1xfeatures2d_1_1StarDetector.html',1,'cv::xfeatures2d']]], + ['starkernelcensus_1562',['StarKernelCensus',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1stereo_1_1StarKernelCensus.html',1,'cv::stereo::StarKernelCensus< num_images >'],['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1stereo_1_1StarKernelCensus.html#af3ec4d3ebcfc04a3dcbd64c7139f8e23',1,'cv::stereo::StarKernelCensus::StarKernelCensus()']]], + ['start_1563',['start',['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#ad7ce51f1d8797236c97bec49d2b25522',1,'cv::Range::start'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ac979183ede9856427ea8309a91843eaf',1,'cv::GStreamingCompiled::start()'],['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html#a564bc8b0bebcfc6c96f85fc48643e273',1,'cv::TickMeter::start()'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#a73a454d6769e4007da648d984e3193ce',1,'cv::ocl::Timer::start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5f0b7200c4a68f9b939ae84060439707',1,'std::gslice::start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac5e75a2dd40a49ee555fc35d0eeacc1a',1,'std::slice::start()'],['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html#a87f6bd02c5d093b812c0d4790b2181f3',1,'net::mc::tasks::PowerRepeatTask::start()'],['../classnet_1_1websocket_1_1SingleClientWSServer.html#ae5f4b4ef17fb26725e0c6d52909ec9da',1,'net::websocket::SingleClientWSServer::start()'],['../classutil_1_1AsyncTask.html#abe5a114fae049066657d73ccbdd9f3c3',1,'util::AsyncTask::start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac5e75a2dd40a49ee555fc35d0eeacc1a',1,'start()(Global Namespace)']]], + ['start_5farray_1564',['start_array',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a5c53878cf08d463eb4e7ca0270532572.html#a5c53878cf08d463eb4e7ca0270532572',1,'nlohmann::json_sax']]], + ['start_5fauto_5fstep_1565',['START_AUTO_STEP',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a9eb75f61c3e1c55d7d541e14297a0241a5d4e8becb341736fc233b0dc1918ac94',1,'cv::ml::EM']]], + ['start_5fe_5fstep_1566',['START_E_STEP',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a9eb75f61c3e1c55d7d541e14297a0241abade5584fe2152c34ea1ee175691f98c',1,'cv::ml::EM']]], + ['start_5fm_5fstep_1567',['START_M_STEP',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a9eb75f61c3e1c55d7d541e14297a0241a628d2a6f1e5bb6dd0dd1847345d968d2',1,'cv::ml::EM']]], + ['start_5fobject_1568',['start_object',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a0671528b0debb5a348169d61f0382a0f.html#a0671528b0debb5a348169d61f0382a0f',1,'nlohmann::json_sax']]], + ['started_1569',['Started',['https://docs.opencv.org/4.2.0/d4/d73/tutorial_py_contours_begin.html',1,'Contours : Getting Started'],['https://docs.opencv.org/4.2.0/d5/daa/tutorial_js_contours_begin.html',1,'Contours : Getting Started']]], + ['started_1570',['Getting started',['https://eigen.tuxfamily.org/dox/GettingStarted.html',1,'']]], + ['started_20with_20images_1571',['Started with Images',['https://docs.opencv.org/4.2.0/dc/d2e/tutorial_py_image_display.html',1,'Getting Started with Images'],['https://docs.opencv.org/4.2.0/df/d24/tutorial_js_image_display.html',1,'Getting Started with Images']]], + ['started_20with_20videos_1572',['Started with Videos',['https://docs.opencv.org/4.2.0/dd/d43/tutorial_py_video_display.html',1,'Getting Started with Videos'],['https://docs.opencv.org/4.2.0/dd/d00/tutorial_js_video_display.html',1,'Getting Started with Videos']]], + ['startidxs_1573',['startIdxs',['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a2612b67a491c05d726db05492c45476f',1,'cv::DescriptorMatcher::DescriptorCollection']]], + ['startloop_1574',['startLoop',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gae1ae035082d76c7fb981203a974bd4ba',1,'cv::startLoop()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gae1ae035082d76c7fb981203a974bd4ba',1,'startLoop()(Global Namespace)']]], + ['startpointx_1575',['startPointX',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a300d7487fced03e0f781afbad5f6e67d',1,'cv::line_descriptor::KeyLine']]], + ['startpointy_1576',['startPointY',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#ac36c0fe32df87388d9fa6a8def75f7e4',1,'cv::line_descriptor::KeyLine']]], + ['startwindowthread_1577',['startWindowThread',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga2c6ecef4f85d8e5cbefec39c9e82ece0',1,'cv::startWindowThread()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga2c6ecef4f85d8e5cbefec39c9e82ece0',1,'startWindowThread()(Global Namespace)']]], + ['startwriteavi_1578',['startWriteAVI',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a96eb46757885d235b924d0e246d66ceb',1,'cv::AVIWriteContainer']]], + ['startwritechunk_1579',['startWriteChunk',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a0628cd9ee5dcb6997dd233fc370e171c',1,'cv::AVIWriteContainer']]], + ['startwritestruct_1580',['startWriteStruct',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a8bb8183cb82d1b3de9eceb13e44efbae',1,'cv::FileStorage']]], + ['state_1581',['State',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ab25ab28a95a47dd9cd9e26e71398dd3f',1,'cv::FileStorage']]], + ['state_1582',['state',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa53ac52fa536aeabba795a2164a11337',1,'cv::FileStorage::state'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a993bd2e6a5a9b8f3b37ba6049b523136',1,'cv::RNG::state'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a4e97b157edf8205bcc60347a86c9ed86',1,'std::fpos::state(_StateT __st)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#ab0b8ab377a6907428414353bca366234',1,'std::fpos::state() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05907.html#a9d0d2e818e6d6cc0b32e86c984561e6f',1,'std::wbuffer_convert::state()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#abd1382f21442adec3f9935d023017871',1,'std::wstring_convert::state()']]], + ['stateconversionfunction_1583',['stateConversionFunction',['https://docs.opencv.org/4.2.0/da/d2b/classcv_1_1tracking_1_1UkfSystemModel.html#a5ab724eda5b79639eddcea6351c612fd',1,'cv::tracking::UkfSystemModel']]], + ['stateestimator_1584',['stateEstimator',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#ab25e2e36eaba6e155f7227712e8ff178',1,'cv::TrackerModel']]], + ['statefuncjacobianw_1585',['stateFuncJacobianW',['../classfilters_1_1ExtendedKalmanFilter.html#a892d03b2d44ad670f6e592c68d2fe912',1,'filters::ExtendedKalmanFilter']]], + ['statefuncjacobianx_1586',['stateFuncJacobianX',['../classfilters_1_1ExtendedKalmanFilter.html#a28ebe1ffdb671ba81ea92a833aafaaae',1,'filters::ExtendedKalmanFilter']]], + ['stateinit_1587',['stateInit',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a5e0d0f4982531e761f8934c97fe15689',1,'cv::tracking::UnscentedKalmanFilterParams']]], + ['statepost_1588',['statePost',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#add8fb5ac9c04b4600b679698dcb0447d',1,'cv::KalmanFilter']]], + ['statepre_1589',['statePre',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a926dece64b4e0e28c3f58af8b7793669',1,'cv::KalmanFilter']]], + ['static_5fpointer_5fcast_1590',['static_pointer_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6a221c308f0ca0e44b5fffa32a6d4595',1,'std']]], + ['staticsaliency_1591',['StaticSaliency',['https://docs.opencv.org/4.2.0/d5/d87/classcv_1_1saliency_1_1StaticSaliency.html',1,'cv::saliency']]], + ['staticsaliencyfinegrained_1592',['StaticSaliencyFineGrained',['https://docs.opencv.org/4.2.0/da/dd0/classcv_1_1saliency_1_1StaticSaliencyFineGrained.html',1,'cv::saliency::StaticSaliencyFineGrained'],['https://docs.opencv.org/4.2.0/da/dd0/classcv_1_1saliency_1_1StaticSaliencyFineGrained.html#a282bc38fecc2a3d158b38eeadb289a00',1,'cv::saliency::StaticSaliencyFineGrained::StaticSaliencyFineGrained()']]], + ['staticsaliencyspectralresidual_1593',['StaticSaliencySpectralResidual',['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html',1,'cv::saliency::StaticSaliencySpectralResidual'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#a5d691bad0bad797e0bbc0a0673987f54',1,'cv::saliency::StaticSaliencySpectralResidual::StaticSaliencySpectralResidual()']]], + ['statmodel_1594',['StatModel',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html',1,'cv::ml']]], + ['status_1595',['Status',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a507409ce9435dd89857469d12ec06b45',1,'cv::Stitcher']]], + ['status_1596',['status',['https://docs.opencv.org/4.2.0/d1/dda/structcv_1_1DetectionBasedTracker_1_1ExtObject.html#a4745083b1749d5b303e2a2c4edc2462b',1,'cv::DetectionBasedTracker::ExtObject']]], + ['std_1597',['std',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html',1,'std'],['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html#ab7ef42d452e4daacd38a27f0c26ae7a7',1,'cv::TrackerSamplerPF::Params::std']]], + ['std_3a_3a_5f_5fdebug_1598',['__debug',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html',1,'std']]], + ['std_3a_3a_5f_5fdetail_1599',['__detail',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html',1,'std']]], + ['std_3a_3a_5f_5fexception_5fptr_1600',['__exception_ptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05491.html',1,'std']]], + ['std_3a_3a_5f_5fparallel_1601',['__parallel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01581.html',1,'std']]], + ['std_3a_3a_5f_5fprofile_1602',['__profile',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html',1,'std']]], + ['std_3a_3a_5fv2_1603',['_V2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02059.html',1,'std']]], + ['std_3a_3achrono_1604',['chrono',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html',1,'std']]], + ['std_3a_3achrono_3a_3a_5fv2_1605',['_V2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01915.html',1,'std::chrono']]], + ['std_3a_3adecimal_1606',['decimal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01584.html',1,'std']]], + ['std_3a_3aexperimental_1607',['experimental',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09859.html',1,'std']]], + ['std_3a_3aexperimental_3a_3afilesystem_1608',['filesystem',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09859.html',1,'std::experimental']]], + ['std_3a_3aexperimental_3a_3afilesystem_3a_3av1_1609',['v1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09859.html',1,'std::experimental::filesystem']]], + ['std_3a_3aexperimental_3a_3afundamentals_5fv1_1610',['fundamentals_v1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10103.html',1,'std::experimental']]], + ['std_3a_3aexperimental_3a_3afundamentals_5fv2_1611',['fundamentals_v2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10023.html',1,'std::experimental']]], + ['std_3a_3aplaceholders_1612',['placeholders',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01565.html',1,'std']]], + ['std_3a_3aregex_5fconstants_1613',['regex_constants',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html',1,'std']]], + ['std_3a_3arel_5fops_1614',['rel_ops',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html',1,'std']]], + ['std_3a_3athis_5fthread_1615',['this_thread',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01566.html',1,'std']]], + ['std_3a_3atr1_1616',['tr1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01550.html',1,'std']]], + ['std_3a_3atr1_3a_3a_5f_5fdetail_1617',['__detail',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01551.html',1,'std::tr1']]], + ['std_3a_3atr2_1618',['tr2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01552.html',1,'std']]], + ['std_3a_3atr2_3a_3a_5f_5fdetail_1619',['__detail',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01553.html',1,'std::tr2']]], + ['std_5fabs_2eh_1620',['std_abs.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00521.html',1,'']]], + ['std_5farray_1621',['STD_ARRAY',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba780ad3b04e04029c2b8264dfce2e5f6a',1,'cv::_InputArray']]], + ['std_5farray_5fmat_1622',['STD_ARRAY_MAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba6f2510d5b8467dbd29eed8b1db08ed5f',1,'cv::_InputArray']]], + ['std_5fbool_5fvector_1623',['STD_BOOL_VECTOR',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53bab45e0dc7a61826aa715ff6274ed3f959',1,'cv::_InputArray']]], + ['std_5ffunction_2eh_1624',['std_function.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00524.html',1,'']]], + ['std_5fmutex_2eh_1625',['std_mutex.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00527.html',1,'']]], + ['std_5fvector_1626',['STD_VECTOR',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba967fc6460ab5b965c4a75d722ed37380',1,'cv::_InputArray']]], + ['std_5fvector_5fcuda_5fgpu_5fmat_1627',['STD_VECTOR_CUDA_GPU_MAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba92c94c2700563364fd249037fb0a6ce2',1,'cv::_InputArray']]], + ['std_5fvector_5fmat_1628',['STD_VECTOR_MAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba515a6d0a638e2232a37f16c724eb59e8',1,'cv::_InputArray']]], + ['std_5fvector_5fumat_1629',['STD_VECTOR_UMAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba827a421eedd965d75e051fefe0fa092d',1,'cv::_InputArray']]], + ['std_5fvector_5fvector_1630',['STD_VECTOR_VECTOR',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba21a9a638579ea97800bac55c8d8bb52e',1,'cv::_InputArray']]], + ['stdc_2b_2b_2eh_1631',['stdc++.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00719.html',1,'']]], + ['stddev_1632',['stddev',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a43aa93573bdffbacfde869b5a11bed31',1,'normal_distribution< double >::stddev()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a43aa93573bdffbacfde869b5a11bed31',1,'normal_distribution< result_type >::stddev()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a43aa93573bdffbacfde869b5a11bed31',1,'std::normal_distribution::stddev()']]], + ['stdev_1633',['stdev',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1videostab_1_1GaussianMotionFilter.html#ac4150e7d3b37cdb95442e2a633941cb7',1,'cv::videostab::GaussianMotionFilter']]], + ['stdevthresh_1634',['stdevThresh',['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1videostab_1_1ConsistentMosaicInpainter.html#acaf556d32a5248757702bd662fa8d901',1,'cv::videostab::ConsistentMosaicInpainter']]], + ['stdexcept_1635',['stdexcept',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00146.html',1,'']]], + ['stdio_5ffilebuf_1636',['stdio_filebuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html',1,'__gnu_cxx::stdio_filebuf< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#a8b64983961c6d4f32b5021a79ad39447',1,'__gnu_cxx::stdio_filebuf::stdio_filebuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#a777faeb6849444b4663d1cbe543e1ae3',1,'__gnu_cxx::stdio_filebuf::stdio_filebuf(int __fd, std::ios_base::openmode __mode, size_t __size=static_cast< size_t >(BUFSIZ))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#a197c58345703b4c82256fe5c1574273f',1,'__gnu_cxx::stdio_filebuf::stdio_filebuf(std::__c_file *__f, std::ios_base::openmode __mode, size_t __size=static_cast< size_t >(BUFSIZ))']]], + ['stdio_5ffilebuf_2eh_1637',['stdio_filebuf.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01085.html',1,'']]], + ['stdio_5fsync_5ffilebuf_1638',['stdio_sync_filebuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10671.html',1,'__gnu_cxx']]], + ['stdio_5fsync_5ffilebuf_2eh_1639',['stdio_sync_filebuf.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01088.html',1,'']]], + ['stdlib_2eh_1640',['stdlib.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00014.html',1,'']]], + ['stdn_1641',['stdn',['../namespaceutil.html#a1b6af13be4df99a79372afcde0448fe4',1,'util']]], + ['stdtr1c_2b_2b_2eh_1642',['stdtr1c++.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00722.html',1,'']]], + ['steady_5fclock_1643',['steady_clock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01915.html',1,'std::chrono::_V2']]], + ['step_1644',['step',['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#ae913de2a7d43776977be4ed78d0d9765',1,'cv::cudev::GlobPtr::step'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#af46427ea4c9b3fe7687e3afa84baede3',1,'cv::cuda::GpuMat::step'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a7a34062e40db102086a987edc7f5858c',1,'cv::cuda::HostMem::step'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#ad01672bb85b10aff6f89dfcd93b618f5',1,'cv::LineIterator::step'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ab4b0843e64328eb2a026b5b9ede726fe',1,'cv::Mat::step'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a2678296b48502f641189b7300613b230',1,'cv::gapi::own::detail::MatHeader::step'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a96ee14c5d1163cbb90a111539ea40a49',1,'cv::UMat::step'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#aa91e7e76c9247f7192ab70d0c0be4783',1,'cv::_InputArray::step()']]], + ['step1_1645',['step1',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a5ead91d096cca20e59ba9af8574187cc',1,'cv::cuda::GpuMat::step1()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ad6ab81d95b0e52444250b136e0da3cfd',1,'cv::cudev::GpuMat_::step1()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ab51be367c23f9976389efd3eccbded97',1,'cv::cuda::HostMem::step1()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a0066c8eee40c1706395b1e57f00e0857',1,'cv::Mat::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'cv::Mat_::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< double >::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< float >::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< uchar >::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< unsigned char >::step1()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a5bcb8141a5651e69ceeabddf18d8ddfb',1,'cv::UMat::step1()']]], + ['stept_1646',['stepT',['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a1d9a9d12ecf2297a3d540a1985d6f53a',1,'cv::cudev::GpuMat_::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'cv::Mat_::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< double >::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< float >::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< uchar >::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< unsigned char >::stepT()']]], + ['stereo_1647',['Quasi dense Stereo',['https://docs.opencv.org/4.2.0/d7/d5a/tutorial_qds_quasi_dense_stereo.html',1,'']]], + ['stereo_20correspondance_20algorithms_1648',['Stereo Correspondance Algorithms',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html',1,'']]], + ['stereo_20correspondence_1649',['Stereo Correspondence',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html',1,'']]], + ['stereo_20images_1650',['Depth Map from Stereo Images',['https://docs.opencv.org/4.2.0/dd/d53/tutorial_py_depthmap.html',1,'']]], + ['stereo_20matching_1651',['Multiview Stereo Matching',['https://docs.opencv.org/4.2.0/d7/dd5/group__datasets__msm.html',1,'']]], + ['stereo_20module_1652',['Quasi Dense Stereo (stereo module)',['https://docs.opencv.org/4.2.0/d9/d58/tutorial_table_of_content_quasi_dense_stereo.html',1,'']]], + ['stereo_20stereo_20module_1653',['Quasi Dense Stereo (stereo module)',['https://docs.opencv.org/4.2.0/d9/d58/tutorial_table_of_content_quasi_dense_stereo.html',1,'']]], + ['stereo_2ehpp_1654',['stereo.hpp',['https://docs.opencv.org/4.2.0/de/da3/stereo_2stereo_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d24/stereo_8hpp.html',1,'(Global Namespace)']]], + ['stereobeliefpropagation_1655',['StereoBeliefPropagation',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html',1,'cv::cuda']]], + ['stereobinarybm_1656',['StereoBinaryBM',['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html',1,'cv::stereo']]], + ['stereobinarysgbm_1657',['StereoBinarySGBM',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html',1,'cv::stereo']]], + ['stereobm_1658',['StereoBM',['https://docs.opencv.org/4.2.0/db/d8a/classcv_1_1cuda_1_1StereoBM.html',1,'cv::cuda::StereoBM'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html',1,'cv::StereoBM']]], + ['stereocalibrate_1659',['stereoCalibrate',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga91018d80e2a93ade37539f01e6f07de5',1,'cv::stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, InputOutputArray R, InputOutputArray T, OutputArray E, OutputArray F, OutputArray perViewErrors, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga246253dcc6de2e0376c599e7d692303a',1,'cv::stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, OutputArray R, OutputArray T, OutputArray E, OutputArray F, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gadbb3a6ca6429528ef302c784df47949b',1,'cv::fisheye::stereoCalibrate()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga6f1aa828b02e7263394acb5f6821cc84',1,'cv::omnidir::stereoCalibrate()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga91018d80e2a93ade37539f01e6f07de5',1,'stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, InputOutputArray R, InputOutputArray T, OutputArray E, OutputArray F, OutputArray perViewErrors, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga246253dcc6de2e0376c599e7d692303a',1,'stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, OutputArray R, OutputArray T, OutputArray E, OutputArray F, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gadbb3a6ca6429528ef302c784df47949b',1,'stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray K1, InputOutputArray D1, InputOutputArray K2, InputOutputArray D2, Size imageSize, OutputArray R, OutputArray T, int flags=fisheye::CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 100, DBL_EPSILON))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga6f1aa828b02e7263394acb5f6821cc84',1,'stereoCalibrate(InputOutputArrayOfArrays objectPoints, InputOutputArrayOfArrays imagePoints1, InputOutputArrayOfArrays imagePoints2, const Size &imageSize1, const Size &imageSize2, InputOutputArray K1, InputOutputArray xi1, InputOutputArray D1, InputOutputArray K2, InputOutputArray xi2, InputOutputArray D2, OutputArray rvec, OutputArray tvec, OutputArrayOfArrays rvecsL, OutputArrayOfArrays tvecsL, int flags, TermCriteria criteria, OutputArray idx=noArray())(Global Namespace)']]], + ['stereoconstantspacebp_1660',['StereoConstantSpaceBP',['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1cuda_1_1StereoConstantSpaceBP.html',1,'cv::cuda']]], + ['stereographicprojector_1661',['StereographicProjector',['https://docs.opencv.org/4.2.0/d0/ddf/structcv_1_1detail_1_1StereographicProjector.html',1,'cv::detail']]], + ['stereographicwarper_1662',['StereographicWarper',['https://docs.opencv.org/4.2.0/d1/d3d/classcv_1_1detail_1_1StereographicWarper.html',1,'cv::detail::StereographicWarper'],['https://docs.opencv.org/4.2.0/d2/d5e/classcv_1_1StereographicWarper.html',1,'cv::StereographicWarper'],['https://docs.opencv.org/4.2.0/d1/d3d/classcv_1_1detail_1_1StereographicWarper.html#ac2af47f4b063b6c3d11c8ec0e54c5787',1,'cv::detail::StereographicWarper::StereographicWarper()']]], + ['stereomatcher_1663',['StereoMatcher',['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html',1,'cv::stereo::StereoMatcher'],['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html',1,'cv::StereoMatcher']]], + ['stereoreconstruct_1664',['stereoReconstruct',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga907c0cb0b0ec8896f1e60510b546e63a',1,'cv::omnidir::stereoReconstruct()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga907c0cb0b0ec8896f1e60510b546e63a',1,'stereoReconstruct()(Global Namespace)']]], + ['stereorectify_1665',['stereoRectify',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga617b1685d4059c6040827800e72ad2b6',1,'cv::stereoRectify()'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gac1af58774006689056b0f2ef1db55ecc',1,'cv::fisheye::stereoRectify()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gaf055863d589cb166c23cc26fcaa6ce98',1,'cv::omnidir::stereoRectify()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga617b1685d4059c6040827800e72ad2b6',1,'stereoRectify(InputArray cameraMatrix1, InputArray distCoeffs1, InputArray cameraMatrix2, InputArray distCoeffs2, Size imageSize, InputArray R, InputArray T, OutputArray R1, OutputArray R2, OutputArray P1, OutputArray P2, OutputArray Q, int flags=CALIB_ZERO_DISPARITY, double alpha=-1, Size newImageSize=Size(), Rect *validPixROI1=0, Rect *validPixROI2=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gac1af58774006689056b0f2ef1db55ecc',1,'stereoRectify(InputArray K1, InputArray D1, InputArray K2, InputArray D2, const Size &imageSize, InputArray R, InputArray tvec, OutputArray R1, OutputArray R2, OutputArray P1, OutputArray P2, OutputArray Q, int flags, const Size &newImageSize=Size(), double balance=0.0, double fov_scale=1.0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gaf055863d589cb166c23cc26fcaa6ce98',1,'stereoRectify(InputArray R, InputArray T, OutputArray R1, OutputArray R2)(Global Namespace)']]], + ['stereorectifyuncalibrated_1666',['stereoRectifyUncalibrated',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaadc5b14471ddc004939471339294f052',1,'cv::stereoRectifyUncalibrated()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaadc5b14471ddc004939471339294f052',1,'stereoRectifyUncalibrated()(Global Namespace)']]], + ['stereosgbm_1667',['StereoSGBM',['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html',1,'cv']]], + ['sticky_5fbit_1668',['sticky_bit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a3a3b94501085ac7f29f89b8335e886d7',1,'sticky_bit(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a3a3b94501085ac7f29f89b8335e886d7',1,'sticky_bit(Global Namespace)']]], + ['stillimageoutput_1669',['stillImageOutput',['https://docs.opencv.org/4.2.0/d4/d1d/interfaceCvPhotoCamera.html#ad27c86e27dfe3fc626fe9a1bda9e0c73',1,'CvPhotoCamera']]], + ['stitch_1670',['stitch',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a37ee5bacf229e9d0fb9f97c8f5ed1acd',1,'cv::Stitcher::stitch(InputArrayOfArrays images, OutputArray pano)'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a3156a44286a7065ba9e8802023ad2074',1,'cv::Stitcher::stitch(InputArrayOfArrays images, InputArrayOfArrays masks, OutputArray pano)']]], + ['stitcher_1671',['Stitcher',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html',1,'cv']]], + ['stitcher_20class_1672',['High level stitching API (Stitcher class)',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'']]], + ['stitcher_2emarkdown_1673',['stitcher.markdown',['https://docs.opencv.org/4.2.0/dd/d7e/stitcher_8markdown.html',1,'']]], + ['stitching_1674',['Images stitching',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html',1,'']]], + ['stitching_20api_20stitcher_20class_1675',['High level stitching API (Stitcher class)',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'']]], + ['stitching_20module_1676',['Images stitching (stitching module)',['https://docs.opencv.org/4.2.0/d0/d33/tutorial_table_of_content_stitching.html',1,'']]], + ['stitching_20stitching_20module_1677',['Images stitching (stitching module)',['https://docs.opencv.org/4.2.0/d0/d33/tutorial_table_of_content_stitching.html',1,'']]], + ['stitching_2ehpp_1678',['stitching.hpp',['https://docs.opencv.org/4.2.0/dc/d7a/stitching_8hpp.html',1,'']]], + ['stitchingloglevel_1679',['stitchingLogLevel',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga7616573f03568a19c14e3333f104b2af',1,'cv::detail::stitchingLogLevel()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga7616573f03568a19c14e3333f104b2af',1,'stitchingLogLevel()(Global Namespace)']]], + ['stl_20containers_20with_20eigen_1680',['Using STL Containers with Eigen',['https://eigen.tuxfamily.org/dox/group__TopicStlContainers.html',1,'']]], + ['stl_20iterators_20and_20algorithms_1681',['STL iterators and algorithms',['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'']]], + ['stl_5falgo_2eh_1682',['stl_algo.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00530.html',1,'']]], + ['stl_5falgobase_2eh_1683',['stl_algobase.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00533.html',1,'']]], + ['stl_5fbvector_2eh_1684',['stl_bvector.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00536.html',1,'']]], + ['stl_5fconstruct_2eh_1685',['stl_construct.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00539.html',1,'']]], + ['stl_5fdeque_2eh_1686',['stl_deque.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00542.html',1,'']]], + ['stl_5ffunction_2eh_1687',['stl_function.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00545.html',1,'']]], + ['stl_5fheap_2eh_1688',['stl_heap.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00548.html',1,'']]], + ['stl_5fiterator_5fbase_5ffuncs_2eh_1689',['stl_iterator_base_funcs.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00554.html',1,'']]], + ['stl_5fiterator_5fbase_5ftypes_2eh_1690',['stl_iterator_base_types.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00557.html',1,'']]], + ['stl_5flist_2eh_1691',['stl_list.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00560.html',1,'']]], + ['stl_5fmap_2eh_1692',['stl_map.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00563.html',1,'']]], + ['stl_5fmultimap_2eh_1693',['stl_multimap.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00566.html',1,'']]], + ['stl_5fmultiset_2eh_1694',['stl_multiset.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00569.html',1,'']]], + ['stl_5fnumeric_2eh_1695',['stl_numeric.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00572.html',1,'']]], + ['stl_5fpair_2eh_1696',['stl_pair.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00575.html',1,'']]], + ['stl_5fqueue_2eh_1697',['stl_queue.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00578.html',1,'']]], + ['stl_5fraw_5fstorage_5fiter_2eh_1698',['stl_raw_storage_iter.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00581.html',1,'']]], + ['stl_5frelops_2eh_1699',['stl_relops.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00584.html',1,'']]], + ['stl_5fset_2eh_1700',['stl_set.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00587.html',1,'']]], + ['stl_5fstack_2eh_1701',['stl_stack.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00590.html',1,'']]], + ['stl_5ftempbuf_2eh_1702',['stl_tempbuf.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00593.html',1,'']]], + ['stl_5ftree_2eh_1703',['stl_tree.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00596.html',1,'']]], + ['stl_5funinitialized_2eh_1704',['stl_uninitialized.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00599.html',1,'']]], + ['stl_5fvector_2eh_1705',['stl_vector.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00602.html',1,'']]], + ['stop_1706',['stop',['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#a40ac8944e71e457352fa481361a025f2',1,'cv::stereo::MVKernel::stop'],['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ac4061f2d28cf54e48360c8aa06135f38',1,'cv::DetectionBasedTracker::stop()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ae8629e18974fc551af940062ad85a5a7',1,'cv::GStreamingCompiled::stop()'],['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html#aa6dfbdc68373d10e371bd35f92c7adb3',1,'cv::TickMeter::stop()'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#adf6487aa9d91d2282201b197b9bd41d3',1,'cv::ocl::Timer::stop()'],['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html#a7cdd54fa926ecd170ec4e7c215f50592',1,'net::mc::tasks::PowerRepeatTask::stop()'],['../classnet_1_1websocket_1_1SingleClientWSServer.html#ac6eba89635a679c01f7b6891123c1d80',1,'net::websocket::SingleClientWSServer::stop()'],['../classutil_1_1AsyncTask.html#a349580908c4774c5d99159f5be226f95',1,'util::AsyncTask::stop()']]], + ['stopentityanimation_1707',['stopEntityAnimation',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#af64b09bc3720eccdfdeaf13fcc5c8f27',1,'cv::ovis::WindowScene']]], + ['stoploop_1708',['stopLoop',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gad4783dd50a6844a04ac8cb4fe158fdf3',1,'cv::stopLoop()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gad4783dd50a6844a04ac8cb4fe158fdf3',1,'stopLoop()(Global Namespace)']]], + ['storage_20orders_1709',['Storage orders',['https://eigen.tuxfamily.org/dox/group__TopicStorageOrders.html',1,'']]], + ['storageindex_1710',['StorageIndex',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2d1aba3f6c414715d830f760913c7e00',1,'Eigen::DenseBase::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2d1aba3f6c414715d830f760913c7e00',1,'DenseBase< ArrayWrapper< ExpressionType > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2d1aba3f6c414715d830f760913c7e00',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a2d1aba3f6c414715d830f760913c7e00',1,'DenseBase< Solve< Decomposition, RhsType > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a0b540ba724726ebe953f8c0df06081ed',1,'Eigen::SparseMatrixBase::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a0b540ba724726ebe953f8c0df06081ed',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a0b540ba724726ebe953f8c0df06081ed',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a0b540ba724726ebe953f8c0df06081ed',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a0b540ba724726ebe953f8c0df06081ed',1,'SparseMatrixBase< Transpose< MatrixType > >::StorageIndex'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a0b540ba724726ebe953f8c0df06081ed',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::StorageIndex']]], + ['storageoptions_1711',['StorageOptions',['https://eigen.tuxfamily.org/dox/group__enums.html#gaacded1a18ae58b0f554751f6cdf9eb13',1,'Eigen::StorageOptions'],['https://eigen.tuxfamily.org/dox/group__enums.html#gaacded1a18ae58b0f554751f6cdf9eb13',1,'StorageOptions(Global Namespace)']]], + ['store_5faligned_1712',['STORE_ALIGNED',['https://docs.opencv.org/4.2.0/d6/d19/namespacecv_1_1hal.html#afe7c2ef8e1924718cfa3a33010834904ab5cb308631f6c97244313f5a4d09d621',1,'cv::hal']]], + ['store_5faligned_5fnocache_1713',['STORE_ALIGNED_NOCACHE',['https://docs.opencv.org/4.2.0/d6/d19/namespacecv_1_1hal.html#afe7c2ef8e1924718cfa3a33010834904a37cb7fb8de75e609d48468004ffdb4d2',1,'cv::hal']]], + ['store_5funaligned_1714',['STORE_UNALIGNED',['https://docs.opencv.org/4.2.0/d6/d19/namespacecv_1_1hal.html#afe7c2ef8e1924718cfa3a33010834904adcb5798a4d3a33e327c29d5bb95c080a',1,'cv::hal']]], + ['stored_5fdata_1715',['stored_data',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11531.html',1,'__gnu_pbds::detail']]], + ['stored_5fdata_3c_20_5ftv_2c_20null_5ftype_20_3e_1716',['stored_data< _Tv, null_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11535.html',1,'__gnu_pbds::detail']]], + ['stored_5fhash_1717',['stored_hash',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11527.html',1,'__gnu_pbds::detail']]], + ['stored_5fvalue_1718',['stored_value',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11523.html',1,'__gnu_pbds::detail']]], + ['storemode_1719',['StoreMode',['https://docs.opencv.org/4.2.0/d6/d19/namespacecv_1_1hal.html#afe7c2ef8e1924718cfa3a33010834904',1,'cv::hal']]], + ['str_1720',['STR',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a3b0470ed27a22c483c56b74d21b41d1e',1,'cv::FileNode']]], + ['str_1721',['str',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a8659c3a93da87fb8de3ca1fdd6c49bc0',1,'match_results< _Bi_iter >::str(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a8659c3a93da87fb8de3ca1fdd6c49bc0',1,'match_results< _Bi_iter >::str(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02471.html#a8402e3c2b036fbd4c696b2ab70b49681',1,'std::basic_istringstream::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02471.html#a4040d59ec2be579cca6a91fb5595553e',1,'std::basic_istringstream::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02475.html#a5fe89030a53e674de2823d9a8cfec39c',1,'std::basic_ostringstream::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02475.html#a1bfbc5ef2c20f06dfbbe8bf046cffa3a',1,'std::basic_ostringstream::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a710ce01324037dd8787cde291a3608e0',1,'std::basic_stringbuf::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a54d0b95ccabadaa97884f3c54f1943d2',1,'std::basic_stringbuf::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02479.html#a36e49da6993836a79290489fab310077',1,'std::basic_stringstream::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02479.html#a84b6a2da124b5f937c3f5dfa12d70957',1,'std::basic_stringstream::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a8659c3a93da87fb8de3ca1fdd6c49bc0',1,'std::match_results::str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#acf17e2826b47f664e97bcf9be35fd9f2',1,'std::sub_match::str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#acf17e2826b47f664e97bcf9be35fd9f2',1,'sub_match< _Bi_iter >::str()']]], + ['stream_1722',['Stream',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html',1,'cv::cuda::Stream'],['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#aa6434e2f5f29bd81406732b39951c246',1,'cv::cuda::Stream::Stream()'],['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a3da3061ab4b0c737fcb092494b54cec8',1,'cv::cuda::Stream::Stream(const Ptr< GpuMat::Allocator > &allocator)']]], + ['stream_5fiterator_2eh_1723',['stream_iterator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00605.html',1,'']]], + ['streamaccessor_1724',['StreamAccessor',['https://docs.opencv.org/4.2.0/d6/df1/structcv_1_1cuda_1_1StreamAccessor.html',1,'cv::cuda::StreamAccessor'],['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a8362b5c9fdffe61e694647684353b090',1,'cv::cuda::Stream::StreamAccessor']]], + ['streambuf_1725',['streambuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00149.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga462cbd2938d4a2e7f0ffac97d2168f95',1,'std::streambuf'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga462cbd2938d4a2e7f0ffac97d2168f95',1,'streambuf(Global Namespace)']]], + ['streambuf_2etcc_1726',['streambuf.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00608.html',1,'']]], + ['streambuf_5fiterator_2eh_1727',['streambuf_iterator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00611.html',1,'']]], + ['streambuf_5ftype_1728',['streambuf_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a1db6612d72b7c65ea1f15b51109a4101',1,'std::istreambuf_iterator::streambuf_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a1db6612d72b7c65ea1f15b51109a4101',1,'std::istreambuf_iterator::streambuf_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ab758ea69e2618c0f53825685999de776',1,'std::ostreambuf_iterator::streambuf_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ab758ea69e2618c0f53825685999de776',1,'std::ostreambuf_iterator::streambuf_type']]], + ['streamcallback_1729',['StreamCallback',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a9a27b645eaf4c8bf8c73dd7125712b13',1,'cv::cuda::Stream']]], + ['streamoff_1730',['streamoff',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a48649c5c32f0251572b366063ee93032',1,'std']]], + ['streampos_1731',['streampos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5894cfd4b461e2d4ed3b38402ff59c89',1,'std']]], + ['streamsize_1732',['streamsize',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a05eef5582eb5de62b76db4916f7adb84',1,'std']]], + ['streamtype_1733',['StreamType',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a172ccaaba996db5201af1c17c04a5fe8',1,'cv']]], + ['strictlylower_1734',['StrictlyLower',['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cda2424988b6fca98be70b595632753ba81',1,'Eigen::StrictlyLower'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cda2424988b6fca98be70b595632753ba81',1,'StrictlyLower(Global Namespace)']]], + ['strictlyupper_1735',['StrictlyUpper',['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cda7b37877e0b9b0df28c9c2b669a633265',1,'Eigen::StrictlyUpper'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cda7b37877e0b9b0df28c9c2b669a633265',1,'StrictlyUpper(Global Namespace)']]], + ['stride_1736',['Stride',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html',1,'Eigen::Stride< _OuterStrideAtCompileTime, _InnerStrideAtCompileTime >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Eigen::Stride::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Eigen::Stride::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Eigen::Stride::Stride(Index outerStride, Index innerStride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Stride< 0, Value >::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Stride< 0, Value >::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Stride< 0, Value >::Stride(Index outerStride, Index innerStride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Stride(Index outerStride, Index innerStride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Stride< Value, 0 >::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Stride< Value, 0 >::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Stride< Value, 0 >::Stride(Index outerStride, Index innerStride)']]], + ['stride_1737',['stride',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html#a2d2b66c46cc35bda716d05ea4a152ac9',1,'cv::dnn::BaseConvolutionLayer::stride'],['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#af3a1ef5113d31a1bb055067a240973e1',1,'cv::dnn::PoolingLayer::stride'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#af82410455b282716daa1c06401596c09',1,'NCVMatrix::stride()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8a9378455753dd979d6424bdff021820',1,'std::gslice::stride()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab9ee3d00a3ef2be02ac5895894b66ee7',1,'std::slice::stride()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab9ee3d00a3ef2be02ac5895894b66ee7',1,'stride() const(Global Namespace)']]], + ['stride_3c_200_2c_20value_20_3e_1738',['Stride< 0, Value >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html',1,'']]], + ['stride_3c_20stridetype_3a_3aouterstrideatcompiletime_2c_20stridetype_3a_3ainnerstrideatcompiletime_20_3e_1739',['Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html',1,'']]], + ['stride_3c_20value_2c_200_20_3e_1740',['Stride< Value, 0 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html',1,'']]], + ['strides_1741',['strides',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html#aa6acaa46d472fe48978fd889cf65da8d',1,'cv::dnn::BaseConvolutionLayer::strides'],['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a3bace2a59639f3f9eb26c83a5a36b8cd',1,'cv::dnn::PoolingLayer::strides']]], + ['string_1742',['STRING',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a393e00c4e8eca7203f137e1bcb1835e1',1,'cv::FileNode::STRING'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa63b588d5559f64f89a416e656880b949',1,'STRING(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa63b588d5559f64f89a416e656880b949',1,'STRING(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa63b588d5559f64f89a416e656880b949',1,'STRING(Global Namespace)']]], + ['string_1743',['String',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1f6634802eeadfd7245bc75cf3e216c2',1,'cv::String'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga1f6634802eeadfd7245bc75cf3e216c2',1,'String(Global Namespace)']]], + ['string_1744',['string',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00152.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae7fa61092f596efa610a7f672885f3d6',1,'cv::FileNode::string()'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a07eab82f6c82d606787eee9ad73d2bda.html#a07eab82f6c82d606787eee9ad73d2bda',1,'nlohmann::json_sax::string()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01516.html#gaa5dbcd13c2fb305025ac6784482d05a5',1,'std::string'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01516.html#gaa5dbcd13c2fb305025ac6784482d05a5',1,'string(Global Namespace)']]], + ['string_5fconversions_2eh_1745',['string_conversions.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01091.html',1,'']]], + ['string_5ft_1746',['string_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a33593865ffb1860323dcbd52425b90c8.html#a33593865ffb1860323dcbd52425b90c8',1,'nlohmann::basic_json::string_t'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_ae01977a9f3c5b3667b7a2929ed91061e.html#ae01977a9f3c5b3667b7a2929ed91061e',1,'nlohmann::json_sax::string_t']]], + ['string_5ftag_1747',['string_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11215.html',1,'__gnu_pbds']]], + ['string_5ftype_1748',['string_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#af10a9e48b7d0c07aa42e5931d644703f',1,'std::collate::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#af10a9e48b7d0c07aa42e5931d644703f',1,'std::collate::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05899.html#aad3f32937222680b3f47919cdf752b6c',1,'std::collate_byname::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05899.html#aad3f32937222680b3f47919cdf752b6c',1,'std::collate_byname::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#afa0148775189d8fd6ae25409e6c7e880',1,'std::messages::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#afa0148775189d8fd6ae25409e6c7e880',1,'std::messages::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a11e3d55aad9f3e1ce9dfe1514426a441',1,'std::money_get::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a11e3d55aad9f3e1ce9dfe1514426a441',1,'std::money_get::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a34db9f1fec0c7e67646aa4e718e250cd',1,'std::money_put::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a34db9f1fec0c7e67646aa4e718e250cd',1,'std::money_put::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a44855102e480a46ab50cbec6cba6ef1a',1,'std::moneypunct::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a44855102e480a46ab50cbec6cba6ef1a',1,'std::moneypunct::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a12e88768d524b9673b122e1a7665abc2',1,'std::numpunct::string_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a12e88768d524b9673b122e1a7665abc2',1,'std::numpunct::string_type']]], + ['string_5fview_1749',['string_view',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01022.html',1,'']]], + ['stringbuf_1750',['stringbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gad23290abd940b2cf3fa4e5f53669894e',1,'std::stringbuf'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gad23290abd940b2cf3fa4e5f53669894e',1,'stringbuf(Global Namespace)']]], + ['stringfwd_2eh_1751',['stringfwd.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00617.html',1,'']]], + ['strings_1752',['Strings',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01516.html',1,'']]], + ['strings_20with_20freetype_20harfbuzz_1753',['Drawing UTF-8 strings with freetype/harfbuzz',['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html',1,'']]], + ['stringstream_1754',['stringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga3be8e48d91a15a13829c028b195aad70',1,'std::stringstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga3be8e48d91a15a13829c028b195aad70',1,'stringstream(Global Namespace)']]], + ['strip_1755',['strip',['https://docs.opencv.org/4.2.0/d3/d44/classcv_1_1GArray.html#a77da79851e07739edb1d3b869b485a1a',1,'cv::GArray::strip()'],['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#aa3e0fd33a9587046335f9eb87e399f67',1,'cv::detail::strip()']]], + ['strip_5ftype_1756',['strip_type',['https://docs.opencv.org/4.2.0/da/d1b/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GArray_3_01T_01_4_01_4.html#acdb454d1c6a7b3529ca54a5094034d51',1,'cv::detail::GTypeTraits< cv::GArray< T > >']]], + ['strong_5faffinity_5fthr_1757',['strong_affinity_thr',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a0b4e988bc97ea0060dbd955f2ec11361',1,'cv::tbm::TrackerParams']]], + ['strong_5fthreshold_1758',['strong_threshold',['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#aac6fe117f76f42650f0cf8b02d5aed19',1,'cv::linemod::ColorGradient']]], + ['strongclassifierdirectselection_1759',['StrongClassifierDirectSelection',['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html',1,'cv::StrongClassifierDirectSelection'],['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html#afc508b47e213b9a068c535a6da8d935b',1,'cv::StrongClassifierDirectSelection::StrongClassifierDirectSelection()']]], + ['strstream_1760',['strstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00746.html',1,'']]], + ['structural_20analysis_20and_20shape_20descriptors_1761',['Structural Analysis and Shape Descriptors',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'']]], + ['structure_20from_20motion_1762',['Structure From Motion',['https://docs.opencv.org/4.2.0/d8/d8c/group__sfm.html',1,'Structure From Motion'],['https://docs.opencv.org/4.2.0/de/d7c/tutorial_table_of_content_sfm.html',1,'Structure From Motion']]], + ['structure_20tensor_1763',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], + ['structure_20type_1764',['Data Structure Type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01539.html',1,'']]], + ['structured_20forest_20training_1765',['Structured forest training',['https://docs.opencv.org/4.2.0/d2/d59/tutorial_ximgproc_training.html',1,'']]], + ['structured_20forests_20for_20fast_20edge_20detection_1766',['Structured forests for fast edge detection',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html',1,'Structured forests for fast edge detection'],['https://docs.opencv.org/4.2.0/d0/da5/tutorial_ximgproc_prediction.html',1,'Structured forests for fast edge detection']]], + ['structured_20light_20api_1767',['Structured Light API',['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html',1,'']]], + ['structured_20light_20tutorials_1768',['Structured Light tutorials',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_structured_light.html',1,'']]], + ['structured_5fedge_5fdetection_2ehpp_1769',['structured_edge_detection.hpp',['https://docs.opencv.org/4.2.0/d2/df5/structured__edge__detection_8hpp.html',1,'']]], + ['structured_5flight_2ehpp_1770',['structured_light.hpp',['https://docs.opencv.org/4.2.0/df/d33/structured__light_2structured__light_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d23/structured__light_8hpp.html',1,'(Global Namespace)']]], + ['structured_5flight_2emarkdown_1771',['structured_light.markdown',['https://docs.opencv.org/4.2.0/d9/d3e/structured__light_8markdown.html',1,'']]], + ['structurededgedetection_1772',['StructuredEdgeDetection',['https://docs.opencv.org/4.2.0/d8/d54/classcv_1_1ximgproc_1_1StructuredEdgeDetection.html',1,'cv::ximgproc']]], + ['structuredlightpattern_1773',['StructuredLightPattern',['https://docs.opencv.org/4.2.0/d9/dbb/classcv_1_1structured__light_1_1StructuredLightPattern.html',1,'cv::structured_light']]], + ['structures_1774',['Structures',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html',1,'Data Structures'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01536.html',1,'Policy-Based Data Structures'],['https://docs.opencv.org/4.2.0/d5/df1/tutorial_js_some_data_structures.html',1,'Some Data Structures']]], + ['structures_1775',['Basic structures',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html',1,'']]], + ['structures_20and_20operations_1776',['C structures and operations',['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'']]], + ['structures_20having_20eigen_20members_1777',['Structures Having Eigen Members',['https://eigen.tuxfamily.org/dox/group__TopicStructHavingEigenMembers.html',1,'']]], + ['stsassert_1778',['StsAssert',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaaad9981b6501b20252ca09e719fd260e3',1,'cv::Error']]], + ['stsautotrace_1779',['StsAutoTrace',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa123b92bc9c5061fc5ee3c83063ae96b0',1,'cv::Error']]], + ['stsbacktrace_1780',['StsBackTrace',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaad6c1f3c096dc99e1337e325b98b3248a',1,'cv::Error']]], + ['stsbadarg_1781',['StsBadArg',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaaf587497af64537041ee62c04a92b755d',1,'cv::Error']]], + ['stsbadflag_1782',['StsBadFlag',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaabaf8225a48e1263fa91ff31ae38742e1',1,'cv::Error']]], + ['stsbadfunc_1783',['StsBadFunc',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaaf607ce2a27ae969358b4f68ee0c235b4',1,'cv::Error']]], + ['stsbadmask_1784',['StsBadMask',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa5797e3819fb65dca51b9a1154585801c',1,'cv::Error']]], + ['stsbadmemblock_1785',['StsBadMemBlock',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa4c25fd80ffbf300c1cd65a00ab9549b9',1,'cv::Error']]], + ['stsbadpoint_1786',['StsBadPoint',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaaa7c6b67d606e324e64af6d8985262f5e',1,'cv::Error']]], + ['stsbadsize_1787',['StsBadSize',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa1f4e9ad819c291555c6b5ae42e45e86a',1,'cv::Error']]], + ['stsdivbyzero_1788',['StsDivByZero',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa7d22eccfb697c85312bc99ba5370c8d4',1,'cv::Error']]], + ['stserror_1789',['StsError',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaacf93e97abba2e7defa74fe5b99e122ac',1,'cv::Error']]], + ['stsfilteroffseterr_1790',['StsFilterOffsetErr',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa4f2340a0c03c1f55a5d2c40b3451d8a5',1,'cv::Error']]], + ['stsfilterstructcontenterr_1791',['StsFilterStructContentErr',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa5359a20eee5a4850c267cf9f30a116f8',1,'cv::Error']]], + ['stsinplacenotsupported_1792',['StsInplaceNotSupported',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa1f6b9d48182da888af489a651754e558',1,'cv::Error']]], + ['stsinternal_1793',['StsInternal',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaab3e6a206e16ca696761f9cb52ddd9e1d',1,'cv::Error']]], + ['stskernelstructcontenterr_1794',['StsKernelStructContentErr',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa365707f9d2d6fe1d470e9d5b88795bf4',1,'cv::Error']]], + ['stsnoconv_1795',['StsNoConv',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa7b0d3c58f05aaf8e1b7ffc71a6c972f0',1,'cv::Error']]], + ['stsnomem_1796',['StsNoMem',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa27734f018d2dd51cbaa7e3723cfbf43b',1,'cv::Error']]], + ['stsnotimplemented_1797',['StsNotImplemented',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaab5d0063314f64d350a93d091b542d465',1,'cv::Error']]], + ['stsnullptr_1798',['StsNullPtr',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaad7b48332aa1bee326ee0ca3f3f70cb20',1,'cv::Error']]], + ['stsobjectnotfound_1799',['StsObjectNotFound',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaadea8da9c644db9b7984920ba4576d068',1,'cv::Error']]], + ['stsok_1800',['StsOk',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaabaee502ffca14f1b599157f7b2630cef',1,'cv::Error']]], + ['stsoutofrange_1801',['StsOutOfRange',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaae81e61d2aacc2b4355293af68aededd0',1,'cv::Error']]], + ['stsparseerror_1802',['StsParseError',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa916bf0cb589f4ae1b5da5af8a444bd69',1,'cv::Error']]], + ['stsunmatchedformats_1803',['StsUnmatchedFormats',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa13775beec4927a023c6c219ad29aa160',1,'cv::Error']]], + ['stsunmatchedsizes_1804',['StsUnmatchedSizes',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa5fb735c19fa95cab412642fd8085d82e',1,'cv::Error']]], + ['stsunsupportedformat_1805',['StsUnsupportedFormat',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa33999ba3bd3e78ac3f1b615782a103d2',1,'cv::Error']]], + ['stsveclengtherr_1806',['StsVecLengthErr',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa4860313ddd694922075df8e524e3f4bb',1,'cv::Error']]], + ['student_5ft_5fdistribution_1807',['student_t_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html',1,'std']]], + ['studio_1808',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['studio_20debugger_1809',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['style_20guide_1810',['Style Guide',['../md_StyleGuide.html',1,'']]], + ['style_20rules_1811',['Style Rules',['../md_StyleGuide.html#autotoc_md1',1,'']]], + ['stylization_1812',['stylization',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#gacb0f7324017df153d7b5d095aed53206',1,'cv::stylization()'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#gacb0f7324017df153d7b5d095aed53206',1,'stylization()(Global Namespace)']]], + ['stype_1813',['sType',['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1datasets_1_1PD__inriaObj.html#a2c75d7b8905e53e89d80cac873ebb654',1,'cv::datasets::PD_inriaObj']]], + ['sub_1814',['sub',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gab2a1ac8bdeda1de78ec97f9cd8e9ff0a',1,'cv::gapi::sub()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gab2a1ac8bdeda1de78ec97f9cd8e9ff0a',1,'sub()(Global Namespace)']]], + ['sub16s_1815',['sub16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2168b6368851e50c8c6e5c1b39af2abb',1,'cv::hal::sub16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2168b6368851e50c8c6e5c1b39af2abb',1,'sub16s()(Global Namespace)']]], + ['sub16u_1816',['sub16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38881a1fc619c13b879d08947a4f9038',1,'cv::hal::sub16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38881a1fc619c13b879d08947a4f9038',1,'sub16u()(Global Namespace)']]], + ['sub32f_1817',['sub32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7db1a88cf2010a1a413c8d83d46c8373',1,'cv::hal::sub32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7db1a88cf2010a1a413c8d83d46c8373',1,'sub32f()(Global Namespace)']]], + ['sub32s_1818',['sub32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gad6a86901a206d2c9dd37d693f05eece5',1,'cv::hal::sub32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gad6a86901a206d2c9dd37d693f05eece5',1,'sub32s()(Global Namespace)']]], + ['sub64f_1819',['sub64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabcefa88a20f298b67912d253ed180a5b',1,'cv::hal::sub64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabcefa88a20f298b67912d253ed180a5b',1,'sub64f()(Global Namespace)']]], + ['sub8s_1820',['sub8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a0c3f4922f9b2097b585085eae353dd',1,'cv::hal::sub8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a0c3f4922f9b2097b585085eae353dd',1,'sub8s()(Global Namespace)']]], + ['sub8u_1821',['sub8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66404cf0bb4d0b827efad2c86f0b9139',1,'cv::hal::sub8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66404cf0bb4d0b827efad2c86f0b9139',1,'sub8u()(Global Namespace)']]], + ['sub_5fmatch_1822',['sub_match',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html',1,'std']]], + ['sub_5fmatch_3c_20_5fbi_5fiter_20_3e_1823',['sub_match< _Bi_iter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html',1,'']]], + ['subc_1824',['subC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa5979f64bab17bf1717f2842d6c1d53f',1,'cv::gapi::subC()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa5979f64bab17bf1717f2842d6c1d53f',1,'subC()(Global Namespace)']]], + ['subdiagonal_1825',['subDiagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#ac423dbb91157c159bdcb4b5a8371232e',1,'Eigen::Tridiagonalization']]], + ['subdiv2d_1826',['Subdiv2D',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html',1,'cv::Subdiv2D'],['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aed58be264a17cdbe712b6a35036d13cb',1,'cv::Subdiv2D::Subdiv2D()'],['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa9ae8faa2f7a78428b115407bfc3df9e',1,'cv::Subdiv2D::Subdiv2D(Rect rect)']]], + ['subdivision_1827',['Planar Subdivision',['https://docs.opencv.org/4.2.0/df/d5b/group__imgproc__subdiv2d.html',1,'']]], + ['submatrix_1828',['subMatrix',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a892830aff7387b7fa15298250403c95a',1,'cv::omnidir::internal']]], + ['submatrix_5fflag_1829',['SUBMATRIX_FLAG',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ac0da3ccbc32a8894fc03afb9cea40150a1db725f4a7efd16a41581b4fc54e7aad',1,'cv::Mat::SUBMATRIX_FLAG'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#abf9262de727fd7542c5bead234fc41cea1dadb89fba042bf2b7fb5bca8399aa73',1,'cv::UMat::SUBMATRIX_FLAG']]], + ['subpixels_1830',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], + ['subrc_1831',['subRC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga755bf791d27f88ab5b4214575bf4c5a8',1,'cv::gapi::subRC()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga755bf791d27f88ab5b4214575bf4c5a8',1,'subRC()(Global Namespace)']]], + ['subsetofs_1832',['subsetOfs',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#afd2ee09de243483ccbbd9bd5a0676f2f',1,'cv::ml::DTrees::Split']]], + ['subspaceproject_1833',['subspaceProject',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a69c7019a344edc5c55799c16a9fc9ada',1,'cv::LDA']]], + ['subspacereconstruct_1834',['subspaceReconstruct',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#acbf9949e7567e23af5f71c29fcef76d4',1,'cv::LDA']]], + ['substitute_1835',['substitute',['https://docs.opencv.org/4.2.0/dd/db9/structcv_1_1GTransform.html#a65db27befeb10beae9cd452d04bcc589',1,'cv::GTransform']]], + ['substr_1836',['substr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab38b3bdb3cf4f19355202b28b8424997',1,'__gnu_cxx::__versa_string::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< _CharT >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< _CharT, _Traits, _Allocator >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< char >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< char, char_traits< char >, _Byte_alloc >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< char_type, _Traits, _Alloc >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< value_type >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'std::basic_string::substr()']]], + ['subtract_1837',['subtract',['https://docs.opencv.org/4.2.0/d8/d6f/group__core__hal__interface__addsub.html',1,'Element-wise add and subtract'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#adf3a27e2d042073f2d765522c3f2c870',1,'cv::MatOp::subtract(const MatExpr &expr1, const MatExpr &expr2, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a29ace3bec7c07ca07a159c4c6f058ef1',1,'cv::MatOp::subtract(const Scalar &s, const MatExpr &expr, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa0f00d98b4b5edeaeb7b8333b2de353b',1,'cv::subtract()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga6eab60fc250059e2fda79c5636bd067f',1,'cv::cuda::subtract()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa0f00d98b4b5edeaeb7b8333b2de353b',1,'subtract(InputArray src1, InputArray src2, OutputArray dst, InputArray mask=noArray(), int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga6eab60fc250059e2fda79c5636bd067f',1,'subtract(InputArray src1, InputArray src2, OutputArray dst, InputArray mask=noArray(), int dtype=-1, Stream &stream=Stream::Null())(Global Namespace)']]], + ['subtract_5fwith_5fcarry_5fengine_1838',['subtract_with_carry_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html',1,'std::subtract_with_carry_engine< _UIntType, __w, __s, __r >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a61f08bb272f27b8cbba12a25aee3c804',1,'std::subtract_with_carry_engine::subtract_with_carry_engine(result_type __sd)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#aeb01e590a5c84d08db8b5678ca774172',1,'std::subtract_with_carry_engine::subtract_with_carry_engine(_Sseq &__q)']]], + ['subtraction_1839',['Subtraction',['https://docs.opencv.org/4.2.0/db/d5c/tutorial_py_bg_subtraction.html',1,'Background Subtraction'],['https://docs.opencv.org/4.2.0/de/df4/tutorial_js_bg_subtraction.html',1,'Background Subtraction'],['https://docs.opencv.org/4.2.0/d8/d38/tutorial_bgsegm_bg_subtraction.html',1,'Background Subtraction']]], + ['subtraction_20methods_1840',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], + ['subtractive_5frng_1841',['subtractive_rng',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html',1,'__gnu_cxx::subtractive_rng'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html#a4e0180804e5e548805eca04c560571d5',1,'__gnu_cxx::subtractive_rng::subtractive_rng(unsigned int __seed)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html#a8763d20bcd47a2f9acd2da92e39193a8',1,'__gnu_cxx::subtractive_rng::subtractive_rng()']]], + ['subtype_1842',['subtype',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_ac3ca9d09e55342f9588404e1dc2222f0.html#ac3ca9d09e55342f9588404e1dc2222f0',1,'nlohmann::byte_container_with_subtype']]], + ['success_1843',['Success',['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea671a2aeb0f527802806a441d58a80fcf',1,'Eigen::Success'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea671a2aeb0f527802806a441d58a80fcf',1,'Success(Global Namespace)']]], + ['suffix_1844',['suffix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aae76fe76fdc4f6f729e0a55c8c2d4aa4',1,'match_results< _Bi_iter >::suffix() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aae76fe76fdc4f6f729e0a55c8c2d4aa4',1,'match_results< _Bi_iter >::suffix() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aae76fe76fdc4f6f729e0a55c8c2d4aa4',1,'std::match_results::suffix()']]], + ['suitesparseqr_20module_1845',['SuiteSparseQR module',['https://eigen.tuxfamily.org/dox/group__SPQRSupport__Module.html',1,'']]], + ['sum_1846',['Sum',['https://docs.opencv.org/4.2.0/d8/d60/structcv_1_1cudev_1_1Sum.html',1,'cv::cudev']]], + ['sum_1847',['sum',['https://docs.opencv.org/4.2.0/da/d9b/group__core__hal__interface__addWeighted.html',1,'Element-wise weighted sum'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a20b718d8c899611ced3cb29b56258495',1,'cv::CvHaarEvaluator::sum'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#a4cb38f0d72fa738431dffea83763ec37',1,'cv::CvLBPEvaluator::sum'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#ab0c4f9ec72059246c2abfc72c47d5ef0',1,'cv::cuda::SURF_CUDA::sum'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabf296b8981ebb3c123b3ba99e753598f',1,'std::valarray::sum()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabf296b8981ebb3c123b3ba99e753598f',1,'valarray< size_t >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'Eigen::DenseBase::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'DenseBase< ArrayWrapper< ExpressionType > >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'DenseBase< Solve< Decomposition, RhsType > >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'Eigen::SparseMatrix::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar, ColMajor, int >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#af48da9cac4c4d8d06d712f7ca4c81ed9',1,'Eigen::SparseVector::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'Eigen::VectorwiseOp::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Derived, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Derived, Vertical >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::sum()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga716e10a2dd9e228e4d3c95818f106722',1,'cv::sum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga1f582844670199281e8012733b50c582',1,'cv::cuda::sum()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga58d80f9e109fed142b280d673afb795a',1,'cv::gapi::sum()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga716e10a2dd9e228e4d3c95818f106722',1,'sum(InputArray src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga58d80f9e109fed142b280d673afb795a',1,'sum(const GMat &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga1f582844670199281e8012733b50c582',1,'sum(InputArray src, InputArray mask=noArray())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabf296b8981ebb3c123b3ba99e753598f',1,'sum() const(Global Namespace)']]], + ['sum_5f_1848',['sum_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa34154947ab224684ddd1020f9e2fb3c',1,'cv::cudev::sum_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa34154947ab224684ddd1020f9e2fb3c',1,'sum_()(Global Namespace)']]], + ['sum_5ftype_1849',['sum_type',['https://docs.opencv.org/4.2.0/d5/d9e/structcv_1_1V__TypeTraits_3_01double_01_4.html#ae1dcc2903a4fd1b127483d0652c7972d',1,'cv::V_TypeTraits< double >::sum_type'],['https://docs.opencv.org/4.2.0/da/d19/structcv_1_1V__TypeTraits_3_01float_01_4.html#addf6559c1c6f35b3d2d1bf41d62276f0',1,'cv::V_TypeTraits< float >::sum_type'],['https://docs.opencv.org/4.2.0/db/d59/structcv_1_1V__TypeTraits_3_01int64_01_4.html#aaefd05cc8c592f9f06324390f3869d67',1,'cv::V_TypeTraits< int64 >::sum_type'],['https://docs.opencv.org/4.2.0/d0/d9d/structcv_1_1V__TypeTraits_3_01schar_01_4.html#ac218f9ffd228d81f349c86ce4b2d5e06',1,'cv::V_TypeTraits< schar >::sum_type'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1V__TypeTraits_3_01short_01_4.html#ad050b1696b786c8fde99df97845d9cdc',1,'cv::V_TypeTraits< short >::sum_type'],['https://docs.opencv.org/4.2.0/dd/d1d/structcv_1_1V__TypeTraits_3_01uchar_01_4.html#a89d20546254941564a05f5f39212ba38',1,'cv::V_TypeTraits< uchar >::sum_type'],['https://docs.opencv.org/4.2.0/d2/d4d/structcv_1_1V__TypeTraits_3_01uint64_01_4.html#a97cf206cf177db63c3a773c9f1a715f1',1,'cv::V_TypeTraits< uint64 >::sum_type'],['https://docs.opencv.org/4.2.0/d3/d8c/structcv_1_1V__TypeTraits_3_01unsigned_01_4.html#a7770eff9c29998b97d2728791ff47d63',1,'cv::V_TypeTraits< unsigned >::sum_type'],['https://docs.opencv.org/4.2.0/d6/dd5/structcv_1_1V__TypeTraits_3_01ushort_01_4.html#a206f0b4adab67410212fe9322bf2e583',1,'cv::V_TypeTraits< ushort >::sum_type']]], + ['sumexprbody_1850',['SumExprBody',['https://docs.opencv.org/4.2.0/dd/d33/structcv_1_1cudev_1_1SumExprBody.html',1,'cv::cudev']]], + ['sungetc_1851',['sungetc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'__gnu_cxx::enc_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'__gnu_cxx::stdio_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'__gnu_cxx::stdio_sync_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_filebuf< char_type, traits_type >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_streambuf< _Elem, _Tr >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_streambuf< char, _Traits >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_streambuf< char, char_traits< char > >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::basic_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::basic_streambuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::basic_stringbuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::wbuffer_convert::sungetc()']]], + ['super_20resolution_1852',['Super Resolution',['https://docs.opencv.org/4.2.0/d1/d5b/group__datasets__sr.html',1,'Super Resolution'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html',1,'Super Resolution']]], + ['super_20resolution_1853',['DNN used for super resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'']]], + ['super_20resolution_20benchmarking_1854',['Super-resolution benchmarking',['https://docs.opencv.org/4.2.0/dc/d69/tutorial_dnn_superres_benchmark.html',1,'']]], + ['super_20resolution_20using_20cnns_1855',['Super Resolution using CNNs',['https://docs.opencv.org/4.2.0/d8/df8/tutorial_table_of_content_dnn_superres.html',1,'']]], + ['superilu_1856',['SuperILU',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperILU.html',1,'Eigen']]], + ['superlu_1857',['SuperLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLU.html',1,'Eigen']]], + ['superlubase_1858',['SuperLUBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html',1,'Eigen']]], + ['superlubase_3c_20_5fmatrixtype_2c_20superilu_3c_20_5fmatrixtype_20_3e_20_3e_1859',['SuperLUBase< _MatrixType, SuperILU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html',1,'']]], + ['superlubase_3c_20_5fmatrixtype_2c_20superlu_3c_20_5fmatrixtype_20_3e_20_3e_1860',['SuperLUBase< _MatrixType, SuperLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html',1,'']]], + ['superlusupport_20module_1861',['SuperLUSupport module',['https://eigen.tuxfamily.org/dox/group__SuperLUSupport__Module.html',1,'']]], + ['superpixellsc_1862',['SuperpixelLSC',['https://docs.opencv.org/4.2.0/d5/da0/classcv_1_1ximgproc_1_1SuperpixelLSC.html',1,'cv::ximgproc']]], + ['superpixels_1863',['Superpixels',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html',1,'']]], + ['superpixelseeds_1864',['SuperpixelSEEDS',['https://docs.opencv.org/4.2.0/df/d81/classcv_1_1ximgproc_1_1SuperpixelSEEDS.html',1,'cv::ximgproc']]], + ['superpixelslic_1865',['SuperpixelSLIC',['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1ximgproc_1_1SuperpixelSLIC.html',1,'cv::ximgproc']]], + ['superres_2ehpp_1866',['superres.hpp',['https://docs.opencv.org/4.2.0/d8/d2a/superres_8hpp.html',1,'']]], + ['superresolution_1867',['SuperResolution',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html',1,'cv::superres::SuperResolution'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a6b6da407515d5def4552cf513ae9e98a',1,'cv::superres::SuperResolution::SuperResolution()']]], + ['support_1868',['support',['https://docs.opencv.org/4.2.0/dc/db1/tutorial_dnn_custom_layers.html',1,'Custom deep learning layers support'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html',1,'Eigen support'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html',1,'Legacy support'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html',1,'Math with F0-transform support'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html',1,'Math with F1-transform support'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html',1,'OpenCL support'],['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html',1,'OpenGL support'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html',1,'Softfloat support'],['https://docs.opencv.org/4.2.0/d6/d2f/group__highgui__winrt.html',1,'WinRT support']]], + ['support_20modules_1869',['Support modules',['https://eigen.tuxfamily.org/dox/group__Support__modules.html',1,'']]], + ['support_20vector_20machines_1870',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], + ['support_20vector_20machines_20for_20non_20linearly_20separable_20data_1871',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], + ['support_20vector_20machines_20svm_1872',['Support Vector Machines (SVM)',['https://docs.opencv.org/4.2.0/d3/d02/tutorial_py_svm_index.html',1,'']]], + ['supportbackend_1873',['supportBackend',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a14017804fd5e8c28807263bbdb415383',1,'cv::dnn::Layer']]], + ['supportregiontype_1874',['SupportRegionType',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gabd57af723cddf921d0c0601a6e8e789b',1,'cv::optflow::SupportRegionType'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gabd57af723cddf921d0c0601a6e8e789b',1,'SupportRegionType(Global Namespace)']]], + ['supportregiontype_1875',['supportRegionType',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a203bd482fc0efa091faf0e537768d5d1',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['supports_1876',['supports',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a67e89f47a61b1bb016e3b20f644f762e',1,'cv::cuda::DeviceInfo']]], + ['suppress_1877',['suppress',['https://docs.opencv.org/4.2.0/d8/da1/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressor.html#aa829e4bb7e33b11567ec3f040e28a7fc',1,'cv::videostab::MoreAccurateMotionWobbleSuppressor::suppress()'],['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1videostab_1_1NullWobbleSuppressor.html#a73bca4742402ffcc348a9acbfc52d07b',1,'cv::videostab::NullWobbleSuppressor::suppress()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a1c39fa83a31e7c62d80b029b8cc19e80',1,'cv::videostab::WobbleSuppressorBase::suppress()']]], + ['suppress_5funused_5fwarning_1878',['suppress_unused_warning',['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a5f00f5a230b8dc4f63bdd1c8057ace44',1,'cv::util']]], + ['suppressedframe_5f_1879',['suppressedFrame_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a203f58bdb554c66e152401327219beb4',1,'cv::videostab::TwoPassStabilizer']]], + ['surf_1880',['SURF',['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html',1,'cv::xfeatures2d']]], + ['surf_20speeded_20up_20robust_20features_1881',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], + ['surf_5fcuda_1882',['SURF_CUDA',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html',1,'cv::cuda::SURF_CUDA'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#ac6522a440dea4b95807d3a3b3417e6a0',1,'cv::cuda::SURF_CUDA::SURF_CUDA()'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a0f7077b5561a105841be6f1a46a29b6d',1,'cv::cuda::SURF_CUDA::SURF_CUDA(double _hessianThreshold, int _nOctaves=4, int _nOctaveLayers=2, bool _extended=false, float _keypointsRatio=0.01f, bool _upright=false)']]], + ['surface_20matching_1883',['Surface Matching',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html',1,'']]], + ['surface_5fmatching_2ehpp_1884',['surface_matching.hpp',['https://docs.opencv.org/4.2.0/d2/d40/surface__matching_8hpp.html',1,'']]], + ['surfacealignment_1885',['surfaceAlignment',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a125e3c0cbd8c63d07637863dff8b0608',1,'cv::cuda::DeviceInfo']]], + ['surfaceformat_1886',['SurfaceFormat',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gaaac1ece32d7b3efa9afc9811315d35cb',1,'cv::cudacodec::SurfaceFormat'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gaaac1ece32d7b3efa9afc9811315d35cb',1,'SurfaceFormat(Global Namespace)']]], + ['surfdescriptorextractor_1887',['SurfDescriptorExtractor',['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#ga4a54d552fe0a5b05a00d1b49c7b5340c',1,'cv::xfeatures2d::SurfDescriptorExtractor'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#ga4a54d552fe0a5b05a00d1b49c7b5340c',1,'SurfDescriptorExtractor(Global Namespace)']]], + ['surffeaturedetector_1888',['SurfFeatureDetector',['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#ga6af725cc4317bde8fe1176b04fe93d41',1,'cv::xfeatures2d::SurfFeatureDetector'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html#ga6af725cc4317bde8fe1176b04fe93d41',1,'SurfFeatureDetector(Global Namespace)']]], + ['svbacksubst_1889',['SVBackSubst',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab4e620e6fc6c8a27bb2be3d50a840c0b',1,'cv::SVBackSubst()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab4e620e6fc6c8a27bb2be3d50a840c0b',1,'SVBackSubst()(Global Namespace)']]], + ['svd_1890',['SVD',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html',1,'cv::SVD'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a3830f50d56ac2ff7b979e6f7f8991e36',1,'cv::SVD::SVD()'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a54cb96aef54978a3617cb2a2169b689a',1,'cv::SVD::SVD(InputArray src, int flags=0)']]], + ['svd_20module_1891',['SVD module',['https://eigen.tuxfamily.org/dox/group__SVD__Module.html',1,'']]], + ['svd32f_1892',['SVD32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7e379c106c1228dcdac27bab1fb81c6e',1,'cv::hal::SVD32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7e379c106c1228dcdac27bab1fb81c6e',1,'SVD32f()(Global Namespace)']]], + ['svd64f_1893',['SVD64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae50420ada479a479075a154a9e7fb642',1,'cv::hal::SVD64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae50420ada479a479075a154a9e7fb642',1,'SVD64f()(Global Namespace)']]], + ['svdbase_1894',['SVDBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html',1,'Eigen::SVDBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#abed06fc6f4b743e1f76a7b317539da87',1,'Eigen::SVDBase::SVDBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#abed06fc6f4b743e1f76a7b317539da87',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::SVDBase()']]], + ['svdbase_3c_20jacobisvd_3c_20_5fmatrixtype_2c_20qrpreconditioner_20_3e_20_3e_1895',['SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html',1,'']]], + ['svdecomp_1896',['SVDecomp',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab477b5b7b39b370bb03e75b19d2d5109',1,'cv::SVDecomp()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab477b5b7b39b370bb03e75b19d2d5109',1,'SVDecomp(InputArray src, OutputArray w, OutputArray u, OutputArray vt, int flags=0)(Global Namespace)']]], + ['svm_1897',['SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'OCR of Hand-written Data using SVM'],['https://docs.opencv.org/4.2.0/d3/d02/tutorial_py_svm_index.html',1,'Support Vector Machines (SVM)'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html',1,'cv::ml::SVM'],['https://docs.opencv.org/4.2.0/d4/db1/tutorial_py_svm_basics.html',1,'Understanding SVM']]], + ['svmdetector_1898',['svmDetector',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a904130d56281ba264e097e9895c648f5',1,'cv::HOGDescriptor']]], + ['svmsgd_1899',['SVMSGD',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html',1,'cv::ml']]], + ['svmsgdtype_1900',['SvmsgdType',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#ab028695cc8ec1491888d8d03f80bc8c2',1,'cv::ml::SVMSGD']]], + ['swap_1901',['swap',['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#aefa0132aaa70b264555656fd48d7a3f5',1,'cv::util::any::swap'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a7135c058aef51c37884a2b2ae8151631',1,'cv::cuda::GpuMat::swap()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a0e1c66de99997b6fe13959dfb6794f2f',1,'cv::cudev::GpuMat_::swap()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a6eabc73d59936b87292125e17415b053',1,'cv::cuda::HostMem::swap()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#ac084b122b402d3c64976e0ccad57ddaf',1,'cv::util::optional::swap()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ac7471fa2590350e45b30cb72da0f7668',1,'cv::util::variant::swap()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ac7471fa2590350e45b30cb72da0f7668',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a05eed1a275b62f425fe4843edb708956',1,'__gnu_cxx::__versa_string::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'__gnu_debug::basic_string::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11783.html#a3a1a56d0954c344eb4db26dce4b84562',1,'__gnu_pbds::sample_probe_fn::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11787.html#a7a6dee2c024c6c77e605c9814e5979cb',1,'__gnu_pbds::sample_range_hashing::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11791.html#a72bbcd1a06b6196c03a35a880ba6ed72',1,'__gnu_pbds::sample_ranged_hash_fn::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#ae0e145612d3056d7186fffcacce2c85d',1,'__gnu_pbds::sample_resize_policy::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a822549474a8d6f889f3aa0abf99656ce',1,'__gnu_pbds::sample_resize_trigger::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12015.html#a48c1b41db4e557029b119c8c5d6002f8',1,'__gnu_pbds::sample_size_policy::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#ad866a56fdeeed727b04774acdc78ab1e',1,'__gnu_pbds::sample_update_policy::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< _CharT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< _CharT, _Traits, _Allocator >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< char >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< char, char_traits< char >, _Byte_alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< char_type, _Traits, _Alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< value_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a41f78615b6896d0b85bef3aea0e41f2f',1,'deque< _StateSeqT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#afca54335268365fbe964394a8fe5df1b',1,'list< __inp, __rebind_inp >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a104e0215b1b9709a9a3cef3280078ded',1,'match_results< _Bi_iter >::swap(match_results &__that) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'match_results< _Bi_iter >::swap(vector &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a104e0215b1b9709a9a3cef3280078ded',1,'match_results< _Bi_iter >::swap(match_results &__that) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a5cd0631c180f408fe3aa42a384bbaa74',1,'std::basic_regex::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'std::basic_string::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a41f78615b6896d0b85bef3aea0e41f2f',1,'std::deque::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a767521afed6c6768073fdef22d2ed292',1,'std::experimental::fundamentals_v1::any::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a3c41eb7aabcd13c334d38bc68afe2cd8',1,'std::forward_list::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#ad6e98060b15f59120e426a787febf1a5',1,'std::function< _Res(_ArgTypes...)>::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#afca54335268365fbe964394a8fe5df1b',1,'std::list::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a6ab3829e42e61a94d9039fea4c07b62f',1,'std::map::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'std::match_results::swap(vector &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a104e0215b1b9709a9a3cef3280078ded',1,'std::match_results::swap(match_results &__that) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a65f198a3e5054fc993d8519127c7b314',1,'std::multimap::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a42f6bb9c9951b84e1876e29cd3b4b607',1,'std::multiset::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2ad1ef1062ee331c848605434d1d5ef6',1,'std::set::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a2029b19ff5945268a03a130ee05e7e75',1,'std::tr2::dynamic_bitset::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'std::unique_ptr::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a6516afbc423bf1f13c37c3c0324fa0f9',1,'std::unique_ptr< _Tp[], _Dp >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae06bac0d1fbee8603ec2ac806950b1ba',1,'std::unordered_map::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac8d3f27e1315796ddcc9b55378f90ce7',1,'std::unordered_multimap::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a87b28725f19b4afc7e58d052bf07be2f',1,'std::unordered_multiset::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a688f24d7010519e2bfa001db6fe180e7',1,'std::unordered_set::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6033c5c6f21fed896e5ff6a06bba62b9',1,'std::valarray::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'std::vector::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Codecvt >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Res_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Result< _Res > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Result_base >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< bool[]>::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae06bac0d1fbee8603ec2ac806950b1ba',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6033c5c6f21fed896e5ff6a06bba62b9',1,'valarray< size_t >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< __diff_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _CharClassT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _CharT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _Cmpt >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _Node *, _Nodeptr_Alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _RealType >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _State< _TraitsT::char_type > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _StringT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< block_type, allocator_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< Catalog_info * >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< double >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< int >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< result_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< size_t >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< std::pair< _BiIter, int > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< std::pair< _StateIdT, std::vector > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< std::pair< _StrTransT, _StrTransT > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< sub_match< _Bi_iter >, _Alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< sub_match< _BiIter >, _Alloc >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'Eigen::DenseBase::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'Eigen::DenseBase::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'DenseBase< ArrayWrapper< ExpressionType > >::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'DenseBase< ArrayWrapper< ExpressionType > >::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'DenseBase< Solve< Decomposition, RhsType > >::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'DenseBase< Solve< Decomposition, RhsType > >::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'Eigen::SparseMatrix::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar, ColMajor, int >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#af0902c911efcf6f162022175b3efd12b',1,'Eigen::SparseVector::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a0c1ece2f97341c7c7e698d67343421a5',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::swap(MatrixBase< OtherDerived > const &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a4e16e0824796bfa218cc91da98fe05b1',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::swap(TriangularBase< OtherDerived > &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aee0ae36cbfb0336832ebc0374c3c7679.html#aee0ae36cbfb0336832ebc0374c3c7679',1,'nlohmann::basic_json::swap'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a94295a06e0e7b3867fe83afbee4cb202.html#a94295a06e0e7b3867fe83afbee4cb202',1,'nlohmann::basic_json::swap(reference other) noexcept(std::is_nothrow_move_constructible< value_t >::value &&std::is_nothrow_move_assignable< value_t >::value &&std::is_nothrow_move_constructible< json_value >::value &&std::is_nothrow_move_assignable< json_value >::value)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a76126242de262f6d38cadda19e0d13e1.html#a76126242de262f6d38cadda19e0d13e1',1,'nlohmann::basic_json::swap(array_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a57b86bdcfc55557dacc36969adb0417e.html#a57b86bdcfc55557dacc36969adb0417e',1,'nlohmann::basic_json::swap(object_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aac916df9561daf4eaf2372119fe91899.html#aac916df9561daf4eaf2372119fe91899',1,'nlohmann::basic_json::swap(string_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa242e339ebc7583e114f2167a83f8c90.html#aa242e339ebc7583e114f2167a83f8c90',1,'nlohmann::basic_json::swap(binary_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a749a1f5091a5e63ccfe919e0aef986af.html#a749a1f5091a5e63ccfe919e0aef986af',1,'nlohmann::basic_json::swap(typename binary_t::container_type &other)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gafbc8f513f40dc1b7c2d48ea6a5a81776',1,'cv::swap(Mat &a, Mat &b)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaac41913cb7239fd2771b3c3f25349fe0',1,'cv::swap(UMat &a, UMat &b)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gafbc8f513f40dc1b7c2d48ea6a5a81776',1,'swap(Mat &a, Mat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaac41913cb7239fd2771b3c3f25349fe0',1,'swap(UMat &a, UMat &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ac29506dd75ee99d6a88ade595233c6f8',1,'__gnu_cxx::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9d75305041fc556b922d4b3bd2667742',1,'std::swap(pair< _T1, _T2 > &__x, pair< _T1, _T2 > &__y) noexcept(noexcept(__x.swap(__y)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4d5a9efe4608a61cb6c74ddda7f8728f',1,'std::swap(function< _Res(_Args...)> &__x, function< _Res(_Args...)> &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga8cdf0d24423573721c4bdb9b2ffd8a7d',1,'std::swap(basic_regex< _Ch_type, _Rx_traits > &__lhs, basic_regex< _Ch_type, _Rx_traits > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a87939e8186f838ff337074e945c78b6d',1,'std::swap(basic_stringbuf< _CharT, _Traits, _Allocator > &__x, basic_stringbuf< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4dedd893b6faf3eb2e6c6aa0ca0f2e32',1,'std::swap(basic_istringstream< _CharT, _Traits, _Allocator > &__x, basic_istringstream< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab7f8e65ad7deb2a81c9178499d71731a',1,'std::swap(basic_ostringstream< _CharT, _Traits, _Allocator > &__x, basic_ostringstream< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a85a913837de066af6c23b0f4f28e02a0',1,'std::swap(basic_stringstream< _CharT, _Traits, _Allocator > &__x, basic_stringstream< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4007a6b034645ec64b2d436df27a03ec',1,'std::swap(multiset< _Key, _Compare, _Alloc > &__x, multiset< _Key, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9bbb29387dfd4bfad2ef30fb555f649a',1,'std::swap(set< _Key, _Compare, _Alloc > &__x, set< _Key, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae448a7aacea236579e3f239c9448482f',1,'std::swap(multimap< _Key, _Tp, _Compare, _Alloc > &__x, multimap< _Key, _Tp, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab99dc85cd3551cb410655b02a56e5c15',1,'std::swap(basic_filebuf< _CharT, _Traits > &__x, basic_filebuf< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acfe891185fde2307f6e8909338c7b862',1,'std::swap(basic_ifstream< _CharT, _Traits > &__x, basic_ifstream< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4965e732ce5d02e4304dd82bc86e365a',1,'std::swap(basic_ofstream< _CharT, _Traits > &__x, basic_ofstream< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7ccd229f5faee26395b8ee1715576cf0',1,'std::swap(basic_fstream< _CharT, _Traits > &__x, basic_fstream< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aeb866eb47db586b6058b597e97d8b909',1,'std::swap(forward_list< _Tp, _Alloc > &__lx, forward_list< _Tp, _Alloc > &__ly) noexcept(noexcept(__lx.swap(__ly)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a520781978c7299c8f0e206542178d09c',1,'std::swap(map< _Key, _Tp, _Compare, _Alloc > &__x, map< _Key, _Tp, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga2700089f8b9371e6aafdb9a7e7a552e7',1,'std::swap(packaged_task< _Res(_ArgTypes...)> &__x, packaged_task< _Res(_ArgTypes...)> &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga77f74f34f378f6d6b5b987ab9a684c2d',1,'std::swap(tuple< _Elements... > &__x, tuple< _Elements... > &__y) noexcept(noexcept(__x.swap(__y)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a89a3a6f9c11a9ade523d0be6e5b3a190',1,'std::swap(vector< _Tp, _Alloc > &__x, vector< _Tp, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e4c5e4d115e26e6d2e4adf552d9a90',1,'std::swap(match_results< _Bi_iter, _Alloc > &__lhs, match_results< _Bi_iter, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a335bd8d8bfd13a75e2e5c34552ec3daf',1,'std::swap(list< _Tp, _Alloc > &__x, list< _Tp, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7e6765b86dfe7f33455aec5b8a7f7e2e',1,'std::swap(deque< _Tp, _Alloc > &__x, deque< _Tp, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gafa6fdf3b3bd0b4a333f150d62001e9fc',1,'std::swap(_Tp &__a, _Tp &__b) noexcept(__and_< is_nothrow_move_constructible< _Tp >, is_nothrow_move_assignable< _Tp > >::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga6b5d2a0f9529c41034917992630c6c85',1,'std::swap(_Tp(&__a)[_Nm], _Tp(&__b)[_Nm]) noexcept(__is_nothrow_swappable< _Tp >::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0be9c6cc80dd454ea2212c47538c61c4',1,'std::swap(basic_string< _CharT, _Traits, _Alloc > &__lhs, basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac58580a65df691769770684cc985719d',1,'std::swap(unique_lock< _Mutex > &__x, unique_lock< _Mutex > &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga0d3de8f7ff80877e53d25ca9057e1c0f',1,'std::swap(shared_lock< _Mutex > &__x, shared_lock< _Mutex > &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a9f4d5ac9d6926c4a0e2d97179887cb6c',1,'std::__debug::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a416f44c6d2ed7e920c8bab2362ce8ffb',1,'std::__profile::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga2700089f8b9371e6aafdb9a7e7a552e7',1,'swap(packaged_task< _Res(_ArgTypes...)> &__x, packaged_task< _Res(_ArgTypes...)> &__y) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga0d3de8f7ff80877e53d25ca9057e1c0f',1,'swap(shared_lock< _Mutex > &__x, shared_lock< _Mutex > &__y) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6033c5c6f21fed896e5ff6a06bba62b9',1,'swap(valarray< _Tp > &__v) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga8cdf0d24423573721c4bdb9b2ffd8a7d',1,'swap(basic_regex< _Ch_type, _Rx_traits > &__lhs, basic_regex< _Ch_type, _Rx_traits > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e4c5e4d115e26e6d2e4adf552d9a90',1,'swap(match_results< _Bi_iter, _Alloc > &__lhs, match_results< _Bi_iter, _Alloc > &__rhs) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#ga8007443c4b8291e332ef93b1875440b9',1,'swap(any &__x, any &__y) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9d75305041fc556b922d4b3bd2667742',1,'swap(pair< _T1, _T2 > &__x, pair< _T1, _T2 > &__y) noexcept(noexcept(__x.swap(__y)))(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga77f74f34f378f6d6b5b987ab9a684c2d',1,'swap(tuple< _Elements... > &__x, tuple< _Elements... > &__y) noexcept(noexcept(__x.swap(__y)))(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gafa6fdf3b3bd0b4a333f150d62001e9fc',1,'swap(_Tp &__a, _Tp &__b) noexcept(__and_< is_nothrow_move_constructible< _Tp >, is_nothrow_move_assignable< _Tp > >::value)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga6b5d2a0f9529c41034917992630c6c85',1,'swap(_Tp(&__a)[_Nm], _Tp(&__b)[_Nm]) noexcept(__is_nothrow_swappable< _Tp >::value)(Global Namespace)']]], + ['swap_5franges_1902',['swap_ranges',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gae9603907c05659cb5cfc6ea20be9ae01',1,'std::swap_ranges()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gae9603907c05659cb5cfc6ea20be9ae01',1,'swap_ranges()(Global Namespace)']]], + ['swapchannels_1903',['swapChannels',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga75a29cc4a97cde0d43ea066b01de927e',1,'cv::cuda::swapChannels()'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga75a29cc4a97cde0d43ea066b01de927e',1,'swapChannels()(Global Namespace)']]], + ['swapedges_1904',['swapEdges',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1e1fb5d4dceadb03ac61c678cf1afb7f',1,'cv::Subdiv2D']]], + ['swapendian_1905',['swapEndian',['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html#abe2a117d06ff01ec0ce31782cf2aff52',1,'cv::cnn_3dobj::icoSphere']]], + ['swapfeature_1906',['swapFeature',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a64898258ae7de0da05dc80bc18c29c32',1,'cv::TrackerFeatureHAAR::swapFeature(int source, int target)'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a50d20081386f85b3dabe20caa1d229a8',1,'cv::TrackerFeatureHAAR::swapFeature(int id, CvHaarEvaluator::FeatureHaar &feature)']]], + ['swapping_20using_20face_20landmark_20detection_1907',['Face swapping using face landmark detection',['https://docs.opencv.org/4.2.0/d1/d52/tutorial_face_swapping_face_landmark_detection.html',1,'']]], + ['swervedrivekinematics_1908',['SwerveDriveKinematics',['../classkinematics_1_1SwerveDriveKinematics.html',1,'kinematics::SwerveDriveKinematics'],['../classkinematics_1_1SwerveDriveKinematics.html#aacea45f4e805cb42850ddb1fd7e7533f',1,'kinematics::SwerveDriveKinematics::SwerveDriveKinematics()']]], + ['swervewheelvel_5ft_1909',['swervewheelvel_t',['../structkinematics_1_1swervewheelvel__t.html',1,'kinematics']]], + ['swishlayer_1910',['SwishLayer',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1dnn_1_1SwishLayer.html',1,'cv::dnn']]], + ['switchtoselectivesearchfast_1911',['switchToSelectiveSearchFast',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a4ea50c9a9df83193dc16f9b74bd95805',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], + ['switchtoselectivesearchquality_1912',['switchToSelectiveSearchQuality',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a4824333bbdd5877e14859298a2ecde12',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], + ['switchtosinglestrategy_1913',['switchToSingleStrategy',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a15995e73a7476442dda5b4210e1e177a',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], + ['symbol_1914',['symbol',['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#a45265d0feab99428177831a24374854f',1,'cv::viz::KeyboardEvent']]], + ['symbolexpr_1915',['SymbolExpr',['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolExpr.html',1,'Eigen::symbolic']]], + ['symbolvalue_1916',['SymbolValue',['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolValue.html',1,'Eigen::symbolic::SymbolValue< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolValue.html#a2db2a280f108f3253e4f21858a2d14ca',1,'Eigen::symbolic::SymbolValue::SymbolValue()']]], + ['symedge_1917',['symEdge',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aabbb10b8d5b0311b7e22040fc0db56b4',1,'cv::Subdiv2D']]], + ['symetriccensus_1918',['SymetricCensus',['https://docs.opencv.org/4.2.0/dd/d24/classcv_1_1stereo_1_1SymetricCensus.html',1,'cv::stereo::SymetricCensus< num_images >'],['https://docs.opencv.org/4.2.0/dd/d24/classcv_1_1stereo_1_1SymetricCensus.html#aec7d620a84cd10c722ff58dee97734c4',1,'cv::stereo::SymetricCensus::SymetricCensus()']]], + ['symetriccensustransform_1919',['symetricCensusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a36512a3362c08ac5f26e9c7e7eca1abb',1,'cv::stereo::symetricCensusTransform(const cv::Mat &img1, const cv::Mat &img2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2, const int type)'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a966b36bd327d3da0025d71fa41d361c2',1,'cv::stereo::symetricCensusTransform(const cv::Mat &img1, int kernelSize, cv::Mat &dist1, const int type)']]], + ['symlink_5fnofollow_1920',['symlink_nofollow',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a158f9bd59daefad511af9171cb1ca644',1,'symlink_nofollow(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145a158f9bd59daefad511af9171cb1ca644',1,'symlink_nofollow(Global Namespace)']]], + ['symmetric_1921',['Symmetric',['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cdad5381b2d1c8973a08303c94e7da02333',1,'Eigen::Symmetric'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga39e3366ff5554d731e7dc8bb642f83cdad5381b2d1c8973a08303c94e7da02333',1,'Symmetric(Global Namespace)']]], + ['symmetric_5fgrid_1922',['SYMMETRIC_GRID',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#ad83bbd88c4d01f670638e8ef4ffa6240a906cc75c28fca6241be50f284c5defd8',1,'cv::CirclesGridFinderParameters']]], + ['sync_1923',['sync',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'__gnu_cxx::enc_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'__gnu_cxx::stdio_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10671.html#aaf870a6b01d27af87ca27c16e601d1df',1,'__gnu_cxx::stdio_sync_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'basic_filebuf< char_type, traits_type >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_iostream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_iostream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char, _Traits >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char, _Traits >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'basic_streambuf< _Elem, _Tr >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'basic_streambuf< char, _Traits >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'basic_streambuf< char, char_traits< char > >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'std::basic_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_fstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_fstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_ifstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_ifstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_iostream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_iostream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'std::basic_streambuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'std::basic_stringbuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_stringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_stringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05907.html#aba9f090cf1273168ea80a024419dab92',1,'std::wbuffer_convert::sync()']]], + ['sync_5fwith_5fstdio_1924',['sync_with_stdio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_ios< char, _Traits >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_iostream< char >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_istream< char >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_istream< char, _Traits >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_ostream< char >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_ostream< char, _Traits >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_fstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ifstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ios::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_iostream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_istream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_istringstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ofstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ostream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ostringstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_stringstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::ios_base::sync_with_stdio()']]], + ['syntax_5foption_5ftype_1925',['syntax_option_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a510caedb3e640b81620023a85c1280bb',1,'std::regex_constants']]], + ['synth_5faccess_5ftraits_1926',['synth_access_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11955.html',1,'__gnu_pbds::detail::synth_access_traits< Type_Traits, Set, _ATraits >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11959.html#a076ca568f4c7eea0eddeca4690af15c9',1,'__gnu_pbds::detail::trie_traits< Key, Mapped, _ATraits, Node_Update, pat_trie_tag, _Alloc >::synth_access_traits'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11963.html#a2ae24123cf94f809e6baf7cb21b97b3d',1,'__gnu_pbds::detail::trie_traits< Key, null_type, _ATraits, Node_Update, pat_trie_tag, _Alloc >::synth_access_traits']]], + ['synth_5faccess_5ftraits_2ehpp_1927',['synth_access_traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01385.html',1,'']]], + ['syntheticsequencegenerator_1928',['SyntheticSequenceGenerator',['https://docs.opencv.org/4.2.0/d1/dda/classcv_1_1bgsegm_1_1SyntheticSequenceGenerator.html',1,'cv::bgsegm::SyntheticSequenceGenerator'],['https://docs.opencv.org/4.2.0/d1/dda/classcv_1_1bgsegm_1_1SyntheticSequenceGenerator.html#a1252da52b70175c097e304334a0723b6',1,'cv::bgsegm::SyntheticSequenceGenerator::SyntheticSequenceGenerator()']]], + ['system_20functions_20and_20macros_1929',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], + ['system_5fclock_1930',['system_clock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01911.html',1,'std::chrono::_V2']]], + ['system_5ferror_1931',['system_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02855.html',1,'std::system_error'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00155.html',1,'(Global Namespace)']]], + ['systems_1932',['Solving Sparse Linear Systems',['https://eigen.tuxfamily.org/dox/group__TopicSparseSystems.html',1,'']]], + ['systems_1933',['systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'Cross compilation for ARM based Linux systems'],['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'Solving linear least squares systems']]], + ['sz_1934',['sz',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a721c16a853d3bae3f41c8c0e9634b5a3',1,'cv::_InputArray::sz'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a6025c7fd11fa230c2c315673d2d293b3',1,'cv::AutoBuffer::sz'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a6025c7fd11fa230c2c315673d2d293b3',1,'AutoBuffer< double, 1 >::sz'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a6025c7fd11fa230c2c315673d2d293b3',1,'AutoBuffer< int64, 1 >::sz'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a6025c7fd11fa230c2c315673d2d293b3',1,'AutoBuffer< String, 1 >::sz'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a7c4ecb345f1bd57c86f9395c7b82de91',1,'cv::ocl::KernelArg::sz']]] ]; diff --git a/search/all_1d.js b/search/all_1d.js index bb8a18b6..752cb876 100644 --- a/search/all_1d.js +++ b/search/all_1d.js @@ -32,743 +32,724 @@ var searchData= ['table_5fof_5fcontent_5fviz_2emarkdown_29',['table_of_content_viz.markdown',['https://docs.opencv.org/4.2.0/d1/d79/table__of__content__viz_8markdown.html',1,'']]], ['table_5fsize_30',['table_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a8e1ecbf03326b7f71563e2c3f9a40b03',1,'std::ctype< char >::table_size'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a8e1ecbf03326b7f71563e2c3f9a40b03',1,'std::ctype_byname< char >::table_size']]], ['tables_20and_20time_20measurement_20with_20opencv_31',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], - ['tag_32',['Tag',['../classAR_1_1Tag.html',1,'AR']]], + ['tag_32',['Tag',['../classAR_1_1Tag.html',1,'AR::Tag'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolExpr.html#af2c04ad1ee1251a2d540f0d804da4c68',1,'Eigen::symbolic::SymbolExpr::Tag']]], ['tag_33',['tag',['https://docs.opencv.org/4.2.0/d3/d02/structcv_1_1datasets_1_1tag.html',1,'cv::datasets::tag'],['https://docs.opencv.org/4.2.0/d4/dfc/structcv_1_1GCompileArg.html#a5201468ce6b5636e2d2353d6dfb248ed',1,'cv::GCompileArg::tag'],['https://docs.opencv.org/4.2.0/db/d4d/structcv_1_1GKernel.html#a494a84db7b2a631ed5964053302f3424',1,'cv::GKernel::tag'],['https://docs.opencv.org/4.2.0/da/dcd/structcv_1_1gapi_1_1GNetParam.html#a81890d77d59904b6dbd37f685f6687ba',1,'cv::gapi::GNetParam::tag'],['https://docs.opencv.org/4.2.0/d5/d58/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1GKernelPackage_01_4.html#aa38a8d0ae51788b85186e8a9942a4933',1,'cv::detail::CompileArgTag< cv::gapi::GKernelPackage >::tag()'],['https://docs.opencv.org/4.2.0/dc/dbf/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1GNetPackage_01_4.html#a1cb31ddf0f9a495b82d48293b26c2a06',1,'cv::detail::CompileArgTag< cv::gapi::GNetPackage >::tag()'],['https://docs.opencv.org/4.2.0/da/d3c/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1plaidml_1_1config_01_4.html#ab410628526714f15b1ae4b07643d6286',1,'cv::detail::CompileArgTag< cv::gapi::plaidml::config >::tag()'],['https://docs.opencv.org/4.2.0/df/d53/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1use__only_01_4.html#a5bea82c27af9b346babb6e281e20a7b5',1,'cv::detail::CompileArgTag< cv::gapi::use_only >::tag()'],['https://docs.opencv.org/4.2.0/d8/da3/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1wip_1_1draw_1_1freetype__font_01_4.html#ad5da9b2314c4bd4ee9fa5c3956462fd7',1,'cv::detail::CompileArgTag< cv::gapi::wip::draw::freetype_font >::tag()'],['https://docs.opencv.org/4.2.0/d3/d64/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1graph__dump__path_01_4.html#af7ada73b0c025265f8192c1c1d971bb2',1,'cv::detail::CompileArgTag< cv::graph_dump_path >::tag()'],['https://docs.opencv.org/4.2.0/d7/d5e/structcv_1_1detail_1_1CompileArgTag_3_01GFluidOutputRois_01_4.html#a97e4349cec16408012f423d122f7b04f',1,'cv::detail::CompileArgTag< GFluidOutputRois >::tag()'],['https://docs.opencv.org/4.2.0/de/d5f/structcv_1_1detail_1_1CompileArgTag_3_01GFluidParallelFor_01_4.html#a13e64c8d591e908ed4f9b920a36d3ebd',1,'cv::detail::CompileArgTag< GFluidParallelFor >::tag()'],['https://docs.opencv.org/4.2.0/d5/dc7/structcv_1_1detail_1_1CompileArgTag_3_01GFluidParallelOutputRois_01_4.html#a369957b56cb5b7203c57a2a210404bef',1,'cv::detail::CompileArgTag< GFluidParallelOutputRois >::tag()'],['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1GInfer.html#aad07009a04a55b30671a48e273d9c688',1,'cv::GInfer::tag()'],['https://docs.opencv.org/4.2.0/d3/dc3/structcv_1_1GInferList.html#a23d337fb1d56110056b5505ee94b53ae',1,'cv::GInferList::tag()'],['https://docs.opencv.org/4.2.0/db/d4e/structcv_1_1detail_1_1NoTag.html#a011fcb29f7bdadc87a0cc7d0d326fa95',1,'cv::detail::NoTag::tag()'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#a71e0a70d2bcae940cea19d594a1e79ee',1,'cv::gapi::ie::Params::tag()']]], - ['tag_34',['Tag',['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolExpr.html#af2c04ad1ee1251a2d540f0d804da4c68',1,'Eigen::symbolic::SymbolExpr']]], - ['tag_5fand_5ftrait_2ehpp_35',['tag_and_trait.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01130.html',1,'']]], - ['tags_36',['Iterator Tags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01514.html',1,'']]], - ['tags_37',['tags',['https://docs.opencv.org/4.2.0/d3/dc5/structcv_1_1datasets_1_1TR__svtObj.html#a892c16af64349c67cdad745004bc7ff7',1,'cv::datasets::TR_svtObj']]], - ['tags_38',['Tags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01537.html',1,'']]], - ['tags_2eh_39',['tags.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00974.html',1,'']]], - ['taking_20eigen_20types_20as_20parameters_40',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], - ['tan_41',['tan',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e5d0b49532d508cf28945e99479dc2e',1,'cv::cudev::tan(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa42448e9d066933568fd36858c124274',1,'cv::cudev::tan(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9b3f9080bab2c5faa052696940f9e3b',1,'cv::cudev::tan(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35550b9a68d4214e3c9701219d42e42f',1,'cv::cudev::tan(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0d5d2dc1b65a22f7aad7160be6caf34',1,'cv::cudev::tan(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab2861d06ea28098768c411c4a004bda',1,'cv::cudev::tan(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffbd6e5d1c6422ce0fa5cd0eefa0642a',1,'cv::cudev::tan(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfaabdc3b38246f96af7222ba86ea236',1,'cv::cudev::tan(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68848db541101ea8520d54ebb6dee279',1,'cv::cudev::tan(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02ae4c03d049fd2d3dfc63c6e6b7fe7f',1,'cv::cudev::tan(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3b7587a9b79be1c5204e13c806acb99',1,'cv::cudev::tan(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3be145ff237e2f1f8629ad62c05c697',1,'cv::cudev::tan(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb155f64a156b28136180f800aee544b',1,'cv::cudev::tan(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed79335a1296246d7e8c42e4edca7cc6',1,'cv::cudev::tan(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd6605162340e91ccc8020655e2f4bac',1,'cv::cudev::tan(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38dfd86d8b6fd18e875c9b7705740ebc',1,'cv::cudev::tan(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbc07cfcdc67d2d74a3b289631431df6',1,'cv::cudev::tan(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ecf20bcddbbe86ae86f921d18d26c88',1,'cv::cudev::tan(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga563c15a76c2beccc8b9e2900a916afc8',1,'cv::cudev::tan(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d93d71234de0828eb63a32d26d869f3',1,'cv::cudev::tan(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga272faade7192828c455c3981530550c4',1,'cv::cudev::tan(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034eba2156aac018f8893dad0d12c1a4',1,'cv::cudev::tan(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa70635fd8b6e9fbe5d8724fd1379ab0d',1,'cv::cudev::tan(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e73678ae8db76dfdab09330a73b4f40',1,'cv::cudev::tan(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6600a1b5c1e762f8eccebbc83e3d83d',1,'cv::cudev::tan(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga343aeebb955e6b8ade7c81de2b503a3f',1,'cv::cudev::tan(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga321bd881717a99b5ce57c6979c7ac812',1,'cv::cudev::tan(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e6bb2a47b4930d3f598a16d12bc8cee',1,'cv::cudev::tan(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a816be188964e277c8505b169def45b',1,'cv::cudev::tan(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf966a66ec4dae52d7c54a783eb143740',1,'cv::cudev::tan(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga354b53c655eeaaa0cdb34c731550a18d',1,'cv::cudev::tan(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8c860990267c06b55433e94667d00df',1,'cv::cudev::tan(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e5d0b49532d508cf28945e99479dc2e',1,'tan(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa42448e9d066933568fd36858c124274',1,'tan(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9b3f9080bab2c5faa052696940f9e3b',1,'tan(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35550b9a68d4214e3c9701219d42e42f',1,'tan(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0d5d2dc1b65a22f7aad7160be6caf34',1,'tan(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab2861d06ea28098768c411c4a004bda',1,'tan(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffbd6e5d1c6422ce0fa5cd0eefa0642a',1,'tan(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfaabdc3b38246f96af7222ba86ea236',1,'tan(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68848db541101ea8520d54ebb6dee279',1,'tan(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02ae4c03d049fd2d3dfc63c6e6b7fe7f',1,'tan(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3b7587a9b79be1c5204e13c806acb99',1,'tan(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3be145ff237e2f1f8629ad62c05c697',1,'tan(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb155f64a156b28136180f800aee544b',1,'tan(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed79335a1296246d7e8c42e4edca7cc6',1,'tan(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd6605162340e91ccc8020655e2f4bac',1,'tan(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38dfd86d8b6fd18e875c9b7705740ebc',1,'tan(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbc07cfcdc67d2d74a3b289631431df6',1,'tan(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ecf20bcddbbe86ae86f921d18d26c88',1,'tan(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga563c15a76c2beccc8b9e2900a916afc8',1,'tan(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d93d71234de0828eb63a32d26d869f3',1,'tan(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga272faade7192828c455c3981530550c4',1,'tan(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034eba2156aac018f8893dad0d12c1a4',1,'tan(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa70635fd8b6e9fbe5d8724fd1379ab0d',1,'tan(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e73678ae8db76dfdab09330a73b4f40',1,'tan(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6600a1b5c1e762f8eccebbc83e3d83d',1,'tan(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga343aeebb955e6b8ade7c81de2b503a3f',1,'tan(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga321bd881717a99b5ce57c6979c7ac812',1,'tan(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e6bb2a47b4930d3f598a16d12bc8cee',1,'tan(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a816be188964e277c8505b169def45b',1,'tan(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf966a66ec4dae52d7c54a783eb143740',1,'tan(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga354b53c655eeaaa0cdb34c731550a18d',1,'tan(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8c860990267c06b55433e94667d00df',1,'tan(const double1 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga530419a3cf68024cd03985a4795214e3',1,'std::tan()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga530419a3cf68024cd03985a4795214e3',1,'tan()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a3bc116a6243f38c22f851581aa7b521a',1,'Eigen::tan()']]], - ['tan_5f_42',['tan_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6dec9edbdc5eb832badd1e8a0f64bf2f',1,'cv::cudev::tan_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6dec9edbdc5eb832badd1e8a0f64bf2f',1,'tan_()(Global Namespace)']]], - ['tan_5ffunc_43',['tan_func',['https://docs.opencv.org/4.2.0/d7/d3e/structcv_1_1cudev_1_1tan__func.html',1,'cv::cudev']]], - ['tan_5ffunc_3c_20double_20_3e_44',['tan_func< double >',['https://docs.opencv.org/4.2.0/db/dc4/structcv_1_1cudev_1_1tan__func_3_01double_01_4.html',1,'cv::cudev']]], - ['tan_5ffunc_3c_20float_20_3e_45',['tan_func< float >',['https://docs.opencv.org/4.2.0/d5/d4e/structcv_1_1cudev_1_1tan__func_3_01float_01_4.html',1,'cv::cudev']]], - ['tan_5ffunc_3c_20schar_20_3e_46',['tan_func< schar >',['https://docs.opencv.org/4.2.0/d7/d9d/structcv_1_1cudev_1_1tan__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['tan_5ffunc_3c_20short_20_3e_47',['tan_func< short >',['https://docs.opencv.org/4.2.0/d6/dbd/structcv_1_1cudev_1_1tan__func_3_01short_01_4.html',1,'cv::cudev']]], - ['tan_5ffunc_3c_20uchar_20_3e_48',['tan_func< uchar >',['https://docs.opencv.org/4.2.0/d2/d0d/structcv_1_1cudev_1_1tan__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['tan_5ffunc_3c_20uint_20_3e_49',['tan_func< uint >',['https://docs.opencv.org/4.2.0/d6/d9e/structcv_1_1cudev_1_1tan__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['tan_5ffunc_3c_20ushort_20_3e_50',['tan_func< ushort >',['https://docs.opencv.org/4.2.0/d2/d63/structcv_1_1cudev_1_1tan__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['tanh_51',['tanh',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c3552307e19fc605da2e9701059f7d4',1,'cv::cudev::tanh(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c5395068317219fd153592b8ad9336',1,'cv::cudev::tanh(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58dea08dd173dcdedd59a006e7ca07cb',1,'cv::cudev::tanh(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ee6a8eee9ed53b87443f9492ca613cf',1,'cv::cudev::tanh(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga867e1d2329bf43d6cde7980fdca51559',1,'cv::cudev::tanh(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa393aec6df5d816067b8a145f95acfdb',1,'cv::cudev::tanh(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga194a2fb5810da42d7d787d4f0cfcd290',1,'cv::cudev::tanh(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8de54e2fea59ac5ef67c180f18caefdd',1,'cv::cudev::tanh(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cedaa513222ede70653b1087ac95e6e',1,'cv::cudev::tanh(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a7af2fc1aca6c890ef8df791aa7b0cc',1,'cv::cudev::tanh(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga778d8707774a42fc0cf65d3010b5f474',1,'cv::cudev::tanh(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b532c589eaa2b8828b02cfa1ff0a25b',1,'cv::cudev::tanh(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39eb534ba2c0c6a1f77ffca705b506c7',1,'cv::cudev::tanh(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfdaeb04492a6fabb75d147ea5831417',1,'cv::cudev::tanh(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60caf9e7c3a45201f3245966b599985e',1,'cv::cudev::tanh(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dd2b3295f8ca282c3c8d1e1eeadf6f7',1,'cv::cudev::tanh(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae28e056d1a28f8814d54344ddd2d2dc1',1,'cv::cudev::tanh(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48568accf1cd935c47237c0f9a0b5a6e',1,'cv::cudev::tanh(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e22e66070d0b20442d4282d775ea290',1,'cv::cudev::tanh(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12dfdbac4e66ff3d2a89b688ad38d771',1,'cv::cudev::tanh(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4acd792684185e5ec114fa844a038a90',1,'cv::cudev::tanh(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac146d362245aae4b500580de8e030f05',1,'cv::cudev::tanh(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59379080668d13417552a24405a749c0',1,'cv::cudev::tanh(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae263d03c6ff173d9f52f1bff13cd3070',1,'cv::cudev::tanh(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3dc0a9f3176569af757a5271046440f',1,'cv::cudev::tanh(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2a279d830a6e0e6ee9f81ebdfd48867',1,'cv::cudev::tanh(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37a5ec47f29fc9c5f077f81d75edacce',1,'cv::cudev::tanh(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d490f73a043e8b6c88c27d7c43dbfd8',1,'cv::cudev::tanh(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98ad8c427568c85682202726982cf73f',1,'cv::cudev::tanh(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98f4cdfe2c246ff6738754c976db85b9',1,'cv::cudev::tanh(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga180f392bae31b013c454f9b94538b180',1,'cv::cudev::tanh(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7bd8b3c6ec4cc7f60fd287272706bb2',1,'cv::cudev::tanh(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c3552307e19fc605da2e9701059f7d4',1,'tanh(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c5395068317219fd153592b8ad9336',1,'tanh(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58dea08dd173dcdedd59a006e7ca07cb',1,'tanh(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ee6a8eee9ed53b87443f9492ca613cf',1,'tanh(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga867e1d2329bf43d6cde7980fdca51559',1,'tanh(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa393aec6df5d816067b8a145f95acfdb',1,'tanh(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga194a2fb5810da42d7d787d4f0cfcd290',1,'tanh(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8de54e2fea59ac5ef67c180f18caefdd',1,'tanh(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cedaa513222ede70653b1087ac95e6e',1,'tanh(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a7af2fc1aca6c890ef8df791aa7b0cc',1,'tanh(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga778d8707774a42fc0cf65d3010b5f474',1,'tanh(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b532c589eaa2b8828b02cfa1ff0a25b',1,'tanh(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39eb534ba2c0c6a1f77ffca705b506c7',1,'tanh(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfdaeb04492a6fabb75d147ea5831417',1,'tanh(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60caf9e7c3a45201f3245966b599985e',1,'tanh(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dd2b3295f8ca282c3c8d1e1eeadf6f7',1,'tanh(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae28e056d1a28f8814d54344ddd2d2dc1',1,'tanh(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48568accf1cd935c47237c0f9a0b5a6e',1,'tanh(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e22e66070d0b20442d4282d775ea290',1,'tanh(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12dfdbac4e66ff3d2a89b688ad38d771',1,'tanh(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4acd792684185e5ec114fa844a038a90',1,'tanh(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac146d362245aae4b500580de8e030f05',1,'tanh(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59379080668d13417552a24405a749c0',1,'tanh(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae263d03c6ff173d9f52f1bff13cd3070',1,'tanh(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3dc0a9f3176569af757a5271046440f',1,'tanh(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2a279d830a6e0e6ee9f81ebdfd48867',1,'tanh(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37a5ec47f29fc9c5f077f81d75edacce',1,'tanh(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d490f73a043e8b6c88c27d7c43dbfd8',1,'tanh(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98ad8c427568c85682202726982cf73f',1,'tanh(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98f4cdfe2c246ff6738754c976db85b9',1,'tanh(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga180f392bae31b013c454f9b94538b180',1,'tanh(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7bd8b3c6ec4cc7f60fd287272706bb2',1,'tanh(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaa4aa5a5b2f39aa309bd0add4864b3155',1,'std::tanh()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaa4aa5a5b2f39aa309bd0add4864b3155',1,'tanh()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a0110c233d357169fd58fdf5656992a98',1,'Eigen::tanh()']]], - ['tanh_5f_52',['tanh_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ec3ed1ce39a2701c6ef836791be8c25',1,'cv::cudev::tanh_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ec3ed1ce39a2701c6ef836791be8c25',1,'tanh_()(Global Namespace)']]], - ['tanh_5ffunc_53',['tanh_func',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1tanh__func.html',1,'cv::cudev']]], - ['tanh_5ffunc_3c_20double_20_3e_54',['tanh_func< double >',['https://docs.opencv.org/4.2.0/d4/d9f/structcv_1_1cudev_1_1tanh__func_3_01double_01_4.html',1,'cv::cudev']]], - ['tanh_5ffunc_3c_20float_20_3e_55',['tanh_func< float >',['https://docs.opencv.org/4.2.0/dc/da0/structcv_1_1cudev_1_1tanh__func_3_01float_01_4.html',1,'cv::cudev']]], - ['tanh_5ffunc_3c_20schar_20_3e_56',['tanh_func< schar >',['https://docs.opencv.org/4.2.0/d5/dfc/structcv_1_1cudev_1_1tanh__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['tanh_5ffunc_3c_20short_20_3e_57',['tanh_func< short >',['https://docs.opencv.org/4.2.0/d8/db4/structcv_1_1cudev_1_1tanh__func_3_01short_01_4.html',1,'cv::cudev']]], - ['tanh_5ffunc_3c_20uchar_20_3e_58',['tanh_func< uchar >',['https://docs.opencv.org/4.2.0/d8/d5a/structcv_1_1cudev_1_1tanh__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['tanh_5ffunc_3c_20uint_20_3e_59',['tanh_func< uint >',['https://docs.opencv.org/4.2.0/df/dc6/structcv_1_1cudev_1_1tanh__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['tanh_5ffunc_3c_20ushort_20_3e_60',['tanh_func< ushort >',['https://docs.opencv.org/4.2.0/d6/d68/structcv_1_1cudev_1_1tanh__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['tanhlayer_61',['TanHLayer',['https://docs.opencv.org/4.2.0/df/d66/classcv_1_1dnn_1_1TanHLayer.html',1,'cv::dnn']]], - ['target_62',['Target',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a830568a629457171cb07918537ec66be',1,'cv::ogl::Buffer']]], - ['target_63',['target',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a35397202fc2bfb04958450d0a02836d3',1,'std::function< _Res(_ArgTypes...)>::target() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a1ec2969ae6cf0413547dab469503c843',1,'std::function< _Res(_ArgTypes...)>::target() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a35397202fc2bfb04958450d0a02836d3',1,'std::function< _Res(_ArgTypes...)>::target() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a1ec2969ae6cf0413547dab469503c843',1,'std::function< _Res(_ArgTypes...)>::target() const noexcept']]], - ['target_64',['Target',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga709af7692ba29788182cf573531b0ff5',1,'cv::dnn::Target'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga709af7692ba29788182cf573531b0ff5',1,'Target(Global Namespace)']]], - ['target_5ftype_65',['target_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a68e477681a31511e5586cd30e7642a51',1,'std::function< _Res(_ArgTypes...)>']]], - ['targetarchs_66',['TargetArchs',['https://docs.opencv.org/4.2.0/d9/dee/classcv_1_1cuda_1_1TargetArchs.html',1,'cv::cuda']]], - ['targetheight_67',['targetHeight',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html#ab68aff8db4139bcc72c69a465fcf9304',1,'cv::TrackerTargetState']]], - ['targetid_68',['targetId',['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#af874ec283d3710ba56945a063fddd197',1,'cv::dnn::BackendWrapper']]], - ['targetnum_69',['targetNum',['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html#a9438c65176206878a155f31125ab032f',1,'cv::MultiTracker_Alt']]], - ['targetposition_70',['targetPosition',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html#ac571d40455d89b8976f7464899fa728a',1,'cv::TrackerTargetState']]], - ['targetwidth_71',['targetWidth',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html#ab2995ab3a248e933a21084faf17ac570',1,'cv::TrackerTargetState']]], - ['task_72',['task',['../classnet_1_1mc_1_1tasks_1_1CameraStreamTask.html#ad68f6be566751c9d5b5db67cd65a590e',1,'net::mc::tasks::CameraStreamTask::task()'],['../classutil_1_1AsyncTask.html#a04d4142e57b8738b26f16bc73e9d3962',1,'util::AsyncTask::task()'],['../classutil_1_1PeriodicTask.html#a3bc1c0ba21e0428d03a0485be52d765b',1,'util::PeriodicTask::task()']]], - ['tbl_73',['tbl',['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html#a5f8f32f51813e4750514ff2d33e12384',1,'cv::cudev::LutPtr']]], - ['tccdriver_74',['tccDriver',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ab60a6e246f791951842cfd4e757dbd4d',1,'cv::cuda::DeviceInfo']]], - ['tcoords_75',['tcoords',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#ae5f1cca70c5913a8e224bc668d7f836c',1,'cv::viz::Mesh']]], - ['teal_76',['teal',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#adf605e364215330fdb1d136f47c0a6c5',1,'cv::viz::Color']]], - ['techniques_77',['Performance Measurement and Improvement Techniques',['https://docs.opencv.org/4.2.0/dc/d71/tutorial_py_optimization.html',1,'']]], - ['tegra_20with_20cuda_78',['Building OpenCV for Tegra with CUDA',['https://docs.opencv.org/4.2.0/d6/d15/tutorial_building_tegra_cuda.html',1,'']]], - ['telem_5fperiod_79',['TELEM_PERIOD',['../namespacerobot.html#a014644aaac752932a2caa9d0be8b2842',1,'robot']]], - ['telemetry_5ft_80',['telemetry_t',['../namespacecan.html#a9141a3d03d1375266eac48fb4d2fef37',1,'can']]], - ['telemreporttask_81',['TelemReportTask',['../classnet_1_1mc_1_1tasks_1_1TelemReportTask.html',1,'net::mc::tasks']]], - ['telemtype_5ft_82',['telemtype_t',['../namespacecan.html#af98139e403f1d81f1d91b55695b90ad4',1,'can']]], - ['tellg_83',['tellg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'basic_iostream< char >::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'basic_iostream< char >::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'basic_istream< char >::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'basic_istream< char >::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'basic_istream< char, _Traits >::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'basic_istream< char, _Traits >::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_fstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_fstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_ifstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_ifstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_iostream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_iostream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_istream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_istream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_istringstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_istringstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_stringstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_stringstream::tellg()']]], - ['tellp_84',['tellp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'basic_iostream< char >::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'basic_ostream< char >::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'basic_ostream< char, _Traits >::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'std::basic_fstream::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'std::basic_iostream::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'std::basic_ofstream::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'std::basic_ostream::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'std::basic_ostringstream::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'std::basic_stringstream::tellp()']]], - ['temp1_85',['temp1',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#aa3d064a9194c2815dbe19c056b6dc763',1,'cv::KalmanFilter']]], - ['temp2_86',['temp2',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a14866bd506668eb0ed57b3974b3a1ee7',1,'cv::KalmanFilter']]], - ['temp3_87',['temp3',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#afdbe36066a7d7f560aa02abe6be114d8',1,'cv::KalmanFilter']]], - ['temp4_88',['temp4',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a84342f2d9dec1e6389025ad229401809',1,'cv::KalmanFilter']]], - ['temp5_89',['temp5',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a846c2a6222c6e5d8b1385dfbccc83ae0',1,'cv::KalmanFilter']]], - ['temp_5fcopied_5fumat_90',['TEMP_COPIED_UMAT',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12a66488f9c447b7b12f905eda9df17bde1',1,'cv::UMatData']]], - ['temp_5fumat_91',['TEMP_UMAT',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12a242f7bf6b8e075402f141faf71e31579',1,'cv::UMatData']]], - ['tempcopiedumat_92',['tempCopiedUMat',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a858c76492f954666835719215e04129c',1,'cv::UMatData']]], - ['tempfile_93',['tempfile',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga9fcedbe6d0104d7ce012987478b060d4',1,'cv::tempfile()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga9fcedbe6d0104d7ce012987478b060d4',1,'tempfile()(Global Namespace)']]], - ['template_94',['Template',['https://docs.opencv.org/4.2.0/d2/dc7/structcv_1_1linemod_1_1Template.html',1,'cv::linemod']]], - ['template_20and_20typename_20keywords_20in_20c_95',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], - ['template_20matching_96',['Template Matching',['https://docs.opencv.org/4.2.0/de/da9/tutorial_template_matching.html',1,'Template Matching'],['https://docs.opencv.org/4.2.0/d4/dc6/tutorial_py_template_matching.html',1,'Template Matching'],['https://docs.opencv.org/4.2.0/d8/dd1/tutorial_js_template_matching.html',1,'Template Matching']]], - ['template_20parameter_20file_97',['Exporting a template parameter file',['https://docs.opencv.org/4.2.0/df/dc0/tutorial_qds_export_parameters.html',1,'']]], - ['template_5fid_98',['template_id',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a35299ee9799423ba150fc699bb0e65dd',1,'cv::linemod::Match']]], - ['template_5fmatching_2emarkdown_99',['template_matching.markdown',['https://docs.opencv.org/4.2.0/d1/dd3/template__matching_8markdown.html',1,'']]], - ['template_5fsize_100',['template_size',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a612be59c4f667a6ea372be525c736889',1,'cv::TrackerCSRT::Params']]], - ['templatematching_101',['TemplateMatching',['https://docs.opencv.org/4.2.0/d2/d58/classcv_1_1cuda_1_1TemplateMatching.html',1,'cv::cuda']]], - ['templatematchmodes_102',['TemplateMatchModes',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#ga3a7850640f1fe1f58fe91a2d7583695d',1,'cv::TemplateMatchModes'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#ga3a7850640f1fe1f58fe91a2d7583695d',1,'TemplateMatchModes(Global Namespace)']]], - ['templatepyramid_103',['TemplatePyramid',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#ae2b55fd210e65aa7947d5523f6aee722',1,'cv::linemod::Detector']]], - ['templates_20in_20eigen_104',['Expression templates in Eigen',['https://eigen.tuxfamily.org/dox/TopicEigenExpressionTemplates.html',1,'']]], - ['templatesmap_105',['TemplatesMap',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a76690bb7364a685ebcc45a3813285a4e',1,'cv::linemod::Detector']]], - ['temporary_5fbuffer_106',['temporary_buffer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09223.html',1,'__gnu_cxx::temporary_buffer< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09223.html#a984575528c7bf7f532c7ff4b16a6a09c',1,'__gnu_cxx::temporary_buffer::temporary_buffer()']]], - ['tempumat_107',['tempUMat',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#ae0fe4f5c2d26556d535bc86b02a424d1',1,'cv::UMatData']]], - ['tensor_108',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], - ['term_5fcriteria_5f_109',['term_criteria_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a7cc52deb16df4fd9e3f2bbfd8843a743',1,'cv::detail::BundleAdjusterBase']]], - ['termcrit_110',['termcrit',['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#a6858ee26d31e8537ce6a8ae33d883d4c',1,'cv::BOWKMeansTrainer']]], - ['termcriteria_111',['TermCriteria',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html',1,'cv']]], - ['termcriteria_112',['termCriteria',['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#a20b20fc233b67356fc4e286ea5ec8d2f',1,'cv::TrackerMedianFlow::Params::termCriteria'],['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a0e91ee6fb4015df0a8ba29485fe0cd26',1,'cv::detail::BundleAdjusterBase::termCriteria()']]], - ['termcriteria_113',['TermCriteria',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#ae3130f54d419687a87349da94df1226b',1,'cv::TermCriteria::TermCriteria()'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#aa6ec470a6a29edadcdd5e94e114960f6',1,'cv::TermCriteria::TermCriteria(int type, int maxCount, double epsilon)']]], - ['terminate_114',['terminate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#add3befe08cc677fe78f3e6f6b0c6d29b',1,'std']]], - ['terminate_5fhandler_115',['terminate_handler',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2f2f9edd9cd5d903b65cce6ccb977fdd',1,'std']]], - ['tesseract_20master_20installation_20by_20using_20git_20bash_20version_202_2014_201_20and_20cmake_20version_203_209_201_116',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], - ['test_117',['Point Polygon Test',['https://docs.opencv.org/4.2.0/dc/d48/tutorial_point_polygon_test.html',1,'']]], - ['test_118',['test',['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html#aa9b8dc5897d2d1e981e29c936945afb6',1,'cv::datasets::Dataset::test'],['https://docs.opencv.org/4.2.0/d3/dc8/structcv_1_1detail_1_1has__custom__wrap.html#a3ab3936ed06e2c59320b9ced7b5e5db9',1,'cv::detail::has_custom_wrap::test(check< C, decltype(&GTypeTraits< C >::wrap_value)> *)'],['https://docs.opencv.org/4.2.0/d3/dc8/structcv_1_1detail_1_1has__custom__wrap.html#a02664452df328aeeec0207725f0ed14f',1,'cv::detail::has_custom_wrap::test(...)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#abb1381e9fd6c77312c8a18b2089b5e96',1,'std::bitset::test()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ad5a3a2e3dfac03daf4a39f919e28de55',1,'std::tr2::dynamic_bitset::test()']]], - ['test_5ferror_119',['TEST_ERROR',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggae5b308134f67997a42e5ca48c2713bcbad0e961149b375d9c9e00d79ac4e4f029',1,'cv::ml::TEST_ERROR'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggae5b308134f67997a42e5ca48c2713bcbad0e961149b375d9c9e00d79ac4e4f029',1,'TEST_ERROR(Global Namespace)']]], - ['test_5fpoint_120',['test_point',['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#aa2ed8d5803b1461ebd18729eb0d82061',1,'cv::detail::Timelapser']]], - ['testasyncarray_121',['testAsyncArray',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabc8622f8ea29ba276b1aba3661ceb922',1,'cv::utils::testAsyncArray()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabc8622f8ea29ba276b1aba3661ceb922',1,'testAsyncArray()(Global Namespace)']]], - ['testasyncexception_122',['testAsyncException',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gad0dffd05238563a4ea49c6a3353e528a',1,'cv::utils::testAsyncException()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gad0dffd05238563a4ea49c6a3353e528a',1,'testAsyncException()(Global Namespace)']]], - ['texid_123',['texId',['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#ad13d3a0569c7df67afdbaf6d0f9c11da',1,'cv::ogl::Texture2D']]], - ['texobj_124',['texObj',['https://docs.opencv.org/4.2.0/d2/d09/structcv_1_1cudev_1_1TexturePtr.html#a9c83170d1b47ba8c93cd1c59a91c0cd5',1,'cv::cudev::TexturePtr']]], - ['text_125',['Text',['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html',1,'cv::gapi::wip::draw::Text'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#aa3a6d154cda31c7932cd5bdb9582dea8',1,'cv::gapi::wip::draw::Text::Text()']]], - ['text_126',['text',['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#af8a222703825b9f0f4e424d0e8079e1e',1,'cv::gapi::wip::draw::FText::text'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a48a39ec4887178ad83ac058d4abf2885',1,'cv::gapi::wip::draw::Text::text']]], - ['text_20detection_127',['Scene Text Detection',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html',1,'']]], - ['text_20detection_20and_20recognition_128',['Scene Text Detection and Recognition',['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'']]], - ['text_20module_129',['Text module',['https://docs.opencv.org/4.2.0/d0/dda/tutorial_table_of_content_text.html',1,'']]], - ['text_20recognition_130',['Text Recognition',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html',1,'Scene Text Recognition'],['https://docs.opencv.org/4.2.0/db/d7b/group__datasets__tr.html',1,'Text Recognition']]], - ['text_20with_20opencv_131',['Random generator and text with OpenCV',['https://docs.opencv.org/4.2.0/df/d61/tutorial_random_generator_and_text.html',1,'']]], - ['text_2ehpp_132',['text.hpp',['https://docs.opencv.org/4.2.0/d6/db3/text_8hpp.html',1,'']]], - ['textdetector_133',['TextDetector',['https://docs.opencv.org/4.2.0/de/d25/classcv_1_1text_1_1TextDetector.html',1,'cv::text']]], - ['textdetector_2ehpp_134',['textDetector.hpp',['https://docs.opencv.org/4.2.0/d4/d26/textDetector_8hpp.html',1,'']]], - ['textdetectorcnn_135',['TextDetectorCNN',['https://docs.opencv.org/4.2.0/d1/d66/classcv_1_1text_1_1TextDetectorCNN.html',1,'cv::text']]], - ['textrurethreshold_136',['textrureThreshold',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gaaf28b006567c18b80ffc2ce1a15e10cb',1,'cv::stereo::PropagationParameters::textrureThreshold'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gaaf28b006567c18b80ffc2ce1a15e10cb',1,'textrureThreshold(Global Namespace)']]], - ['texture_137',['Texture',['https://docs.opencv.org/4.2.0/d0/dc5/structcv_1_1cudev_1_1Texture.html',1,'cv::cudev::Texture< class >'],['https://docs.opencv.org/4.2.0/db/d26/structcv_1_1face_1_1FacemarkAAM_1_1Model_1_1Texture.html',1,'cv::face::FacemarkAAM::Model::Texture'],['https://docs.opencv.org/4.2.0/d0/dc5/structcv_1_1cudev_1_1Texture.html#a7893dd705991d7dea826a5c251d82720',1,'cv::cudev::Texture::Texture()']]], - ['texture_138',['texture',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a16b20bbdb9d830145c6c079639cad0fd',1,'cv::viz::Mesh']]], - ['texture_2ehpp_139',['texture.hpp',['https://docs.opencv.org/4.2.0/d1/de0/texture_8hpp.html',1,'']]], - ['texture2d_140',['Texture2D',['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html',1,'cv::ogl::Texture2D'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a5e559b20ea593302282f98bcd1cf784d',1,'cv::ogl::Texture2D::Texture2D()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a01f15a77aed589e236041f8da8beb73a',1,'cv::ogl::Texture2D::Texture2D(int arows, int acols, Format aformat, unsigned int atexId, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a43a07435a33f245f7b2592a86e162490',1,'cv::ogl::Texture2D::Texture2D(Size asize, Format aformat, unsigned int atexId, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1d68da272ef5e37ca21cf7f7d23c9e5f',1,'cv::ogl::Texture2D::Texture2D(int arows, int acols, Format aformat, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a3c8da810e19d71c0b2151e3f46a32068',1,'cv::ogl::Texture2D::Texture2D(Size asize, Format aformat, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a58cbe6f80d2c8eb52505fad86abf1422',1,'cv::ogl::Texture2D::Texture2D(InputArray arr, bool autoRelease=false)']]], - ['texture_5fmax_5fm_141',['texture_max_m',['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#abaf5de71cfaa8e7ed5a4ce75924ec6f4',1,'cv::face::FacemarkAAM::Params']]], - ['texturealignment_142',['textureAlignment',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ac173dbbddf57044299d14fb2db2738a3',1,'cv::cuda::DeviceInfo']]], - ['textured_20object_143',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], - ['textureflattening_144',['textureFlattening',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gad55df6aa53797365fa7cc23959a54004',1,'cv::textureFlattening()'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gad55df6aa53797365fa7cc23959a54004',1,'textureFlattening()(Global Namespace)']]], - ['textureidx_145',['textureIdx',['https://docs.opencv.org/4.2.0/db/d26/structcv_1_1face_1_1FacemarkAAM_1_1Model_1_1Texture.html#a8620762e88d51ac7eccf24ae90c1a077',1,'cv::face::FacemarkAAM::Model::Texture']]], - ['texturepitchalignment_146',['texturePitchAlignment',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a3df99e6d52baa293c1a01fd544b97bf9',1,'cv::cuda::DeviceInfo']]], - ['textureptr_147',['TexturePtr',['https://docs.opencv.org/4.2.0/d2/d09/structcv_1_1cudev_1_1TexturePtr.html',1,'cv::cudev']]], - ['textures_148',['textures',['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#afd7cea8d7e84122a30e851d1f29ab3b7',1,'cv::face::FacemarkAAM::Model']]], - ['tgmath_2eh_149',['tgmath.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00017.html',1,'']]], - ['thash_150',['THash',['https://docs.opencv.org/4.2.0/da/dff/structTHash.html',1,'']]], - ['the_20array_20class_20and_20coefficient_20wise_20operations_151',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], - ['the_20assertion_20on_20unaligned_20arrays_152',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], - ['the_20basic_20image_20container_153',['Mat - The Basic Image Container',['https://docs.opencv.org/4.2.0/d6/d6d/tutorial_mat_the_basic_image_container.html',1,'']]], - ['the_20class_20hierarchy_154',['The class hierarchy',['https://eigen.tuxfamily.org/dox/TopicClassHierarchy.html',1,'']]], - ['the_20cn_20tracker_155',['Customizing the CN Tracker',['https://docs.opencv.org/4.2.0/dc/db8/tutorial_customizing_cn_tracker.html',1,'']]], - ['the_20color_20palette_156',['Trackbar as the Color Palette',['https://docs.opencv.org/4.2.0/d9/dc8/tutorial_py_trackbar.html',1,'']]], - ['the_20contrast_20and_20brightness_20of_20an_20image_157',['Changing the contrast and brightness of an image!',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'']]], - ['the_20core_20functionality_20core_20module_158',['The Core Functionality (core module)',['https://docs.opencv.org/4.2.0/de/d7a/tutorial_table_of_content_core.html',1,'']]], - ['the_20facemark_20api_159',['the Facemark API',['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'Adding a new algorithm to the Facemark API'],['https://docs.opencv.org/4.2.0/d7/dec/tutorial_facemark_usage.html',1,'Using the Facemark API']]], - ['the_20facemarkaam_160',['Using the FacemarkAAM',['https://docs.opencv.org/4.2.0/d5/dd8/tutorial_facemark_aam.html',1,'']]], - ['the_20gpu_161',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], - ['the_20hierarchical_20data_20format_20hdf_20i_20o_162',['The Hierarchical Data Format (hdf) I/O',['https://docs.opencv.org/4.2.0/d3/d00/tutorial_table_of_content_hdf.html',1,'']]], - ['the_20homography_20explained_20with_20code_163',['Basic concepts of the homography explained with code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'']]], - ['the_20human_20retina_20and_20its_20use_20for_20image_20processing_164',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], - ['the_20learning_20based_20white_20balance_20algorithm_165',['Training the learning-based white balance algorithm',['https://docs.opencv.org/4.2.0/dc/dcb/tutorial_xphoto_training_white_balance.html',1,'']]], - ['the_20map_20class_166',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], - ['the_20matrix_20class_167',['The Matrix class',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixClass.html',1,'']]], - ['the_20microsoft_20visual_20studio_168',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['the_20module_20brings_20implementations_20of_20different_20image_20hashing_20algorithms_169',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], - ['the_20opencv_20parallel_5ffor_5f_20to_20parallelize_20your_20code_170',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], - ['the_20template_20and_20typename_20keywords_20in_20c_171',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], - ['the_20visual_20studio_20debugger_172',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['theory_173',['F-transform theory',['https://docs.opencv.org/4.2.0/db/daf/tutorial_fuzzy_theory.html',1,'']]], - ['theory_2emarkdown_174',['theory.markdown',['https://docs.opencv.org/4.2.0/d5/d90/theory_8markdown.html',1,'']]], - ['therng_175',['theRNG',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga75843061d150ad6564b5447e38e57722',1,'cv::theRNG()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga75843061d150ad6564b5447e38e57722',1,'theRNG()(Global Namespace)']]], - ['thick_176',['thick',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#a34bb49c16f726d0fa9c73f3f8f07c70d',1,'cv::gapi::wip::draw::Circle::thick'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#a9e62f5ec8931b9faad1b8f4bec552a79',1,'cv::gapi::wip::draw::Line::thick'],['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#a51fb2626ae3c77cd1a5249d5348e85fa',1,'cv::gapi::wip::draw::Poly::thick'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html#a21e025f7f94ee27104934d58ff7c3288',1,'cv::gapi::wip::draw::Rect::thick'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a6af28010818ad018e85d5cc2e0c884e5',1,'cv::gapi::wip::draw::Text::thick']]], - ['thickness_177',['thickness',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a7f24a20366bf84cf682a9e7c9fed67f1',1,'cv::QtFont']]], - ['thin_5fheap_178',['thin_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12039.html',1,'__gnu_pbds::detail']]], - ['thin_5fheap_5f_2ehpp_179',['thin_heap_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01433.html',1,'']]], - ['thin_5fheap_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_180',['thin_heap_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16715.html',1,'']]], - ['thin_5fheap_5f_2fdebug_5ffn_5fimps_2ehpp_181',['thin_heap_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16787.html',1,'']]], - ['thin_5fheap_5f_2ferase_5ffn_5fimps_2ehpp_182',['thin_heap_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16850.html',1,'']]], - ['thin_5fheap_5f_2ffind_5ffn_5fimps_2ehpp_183',['thin_heap_/find_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16895.html',1,'']]], - ['thin_5fheap_5f_2finsert_5ffn_5fimps_2ehpp_184',['thin_heap_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17015.html',1,'']]], - ['thin_5fheap_5f_2fsplit_5fjoin_5ffn_5fimps_2ehpp_185',['thin_heap_/split_join_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17258.html',1,'']]], - ['thin_5fheap_5f_2ftrace_5ffn_5fimps_2ehpp_186',['thin_heap_/trace_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17303.html',1,'']]], - ['thin_5fheap_5ftag_187',['thin_heap_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11287.html',1,'__gnu_pbds']]], - ['thinning_188',['thinning',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#ga37002c6ca80c978edb6ead5d6b39740c',1,'cv::ximgproc::thinning()'],['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#ga37002c6ca80c978edb6ead5d6b39740c',1,'thinning()(Global Namespace)']]], - ['thinning_5fguohall_189',['THINNING_GUOHALL',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#aa244a73deb4e58ae70ee96afe9d2460badb2002d300bd03c5eb6da108ab9fb36c',1,'cv::ximgproc']]], - ['thinning_5fzhangsuen_190',['THINNING_ZHANGSUEN',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#aa244a73deb4e58ae70ee96afe9d2460bacbe8f65466c9d11a295d1bc7413e3404',1,'cv::ximgproc']]], - ['thinningtypes_191',['ThinningTypes',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#aa244a73deb4e58ae70ee96afe9d2460b',1,'cv::ximgproc']]], - ['thinplatesplineshapetransformer_192',['ThinPlateSplineShapeTransformer',['https://docs.opencv.org/4.2.0/dc/d18/classcv_1_1ThinPlateSplineShapeTransformer.html',1,'cv']]], - ['thousands_5fsep_193',['thousands_sep',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a46179910ed09bd0c59748b7c65ab2f03',1,'std::moneypunct::thousands_sep()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a46179910ed09bd0c59748b7c65ab2f03',1,'std::moneypunct_byname::thousands_sep()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a7d048bb8f665b15327ad467442367219',1,'std::numpunct::thousands_sep()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a7d048bb8f665b15327ad467442367219',1,'std::numpunct_byname::thousands_sep()']]], - ['thread_194',['thread',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02863.html',1,'std::thread'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00158.html',1,'(Global Namespace)']]], - ['threading_195',['Eigen and multi-threading',['https://eigen.tuxfamily.org/dox/TopicMultiThreading.html',1,'']]], - ['threadlineid_196',['threadLineId',['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1Block.html#a88b4a5964e2ff214990975284ee9bbb0',1,'cv::cudev::Block']]], - ['threads_197',['Threads',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01484.html',1,'']]], - ['thresh_198',['thresh',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#a2558a62a1e6b2ad8f47222f175348a6b',1,'cv::videostab::RansacParams::thresh'],['https://docs.opencv.org/4.2.0/df/df5/structcv_1_1cudev_1_1ThreshBinaryFunc.html#a0c87463f3cd296b6134894a64225b937',1,'cv::cudev::ThreshBinaryFunc::thresh'],['https://docs.opencv.org/4.2.0/da/d5e/structcv_1_1cudev_1_1ThreshBinaryInvFunc.html#aecca6be0c90e3acfcfe1af7ce5c9275b',1,'cv::cudev::ThreshBinaryInvFunc::thresh'],['https://docs.opencv.org/4.2.0/df/dd9/structcv_1_1cudev_1_1ThreshToZeroFunc.html#a4f2c2e2eb830f515841f1db7d1239569',1,'cv::cudev::ThreshToZeroFunc::thresh'],['https://docs.opencv.org/4.2.0/d8/d7e/structcv_1_1cudev_1_1ThreshToZeroInvFunc.html#ac41f7d2713a50c115fe9d430091c76b9',1,'cv::cudev::ThreshToZeroInvFunc::thresh'],['https://docs.opencv.org/4.2.0/d0/d44/structcv_1_1cudev_1_1ThreshTruncFunc.html#a21cc0d431f7640b3023dd874c2c4bc01',1,'cv::cudev::ThreshTruncFunc::thresh']]], - ['thresh_5fbinary_199',['THRESH_BINARY',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a147222a96556ebc1d948b372bcd7ac59',1,'cv::THRESH_BINARY'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a147222a96556ebc1d948b372bcd7ac59',1,'THRESH_BINARY(Global Namespace)']]], - ['thresh_5fbinary_5ffunc_200',['thresh_binary_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab82e591988fab29952ec0589463e9b74',1,'cv::cudev::thresh_binary_func()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab82e591988fab29952ec0589463e9b74',1,'thresh_binary_func()(Global Namespace)']]], - ['thresh_5fbinary_5finv_201',['THRESH_BINARY_INV',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a19120b1a11d8067576cc24f4d2f03754',1,'cv::THRESH_BINARY_INV'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a19120b1a11d8067576cc24f4d2f03754',1,'THRESH_BINARY_INV(Global Namespace)']]], - ['thresh_5fbinary_5finv_5ffunc_202',['thresh_binary_inv_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f7eff7288ba28c932d1d657f65a238a',1,'cv::cudev::thresh_binary_inv_func()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f7eff7288ba28c932d1d657f65a238a',1,'thresh_binary_inv_func()(Global Namespace)']]], - ['thresh_5fmask_203',['THRESH_MASK',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a8e723ef461a5349c391032aee325fe15',1,'cv::THRESH_MASK'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a8e723ef461a5349c391032aee325fe15',1,'THRESH_MASK(Global Namespace)']]], - ['thresh_5fotsu_204',['THRESH_OTSU',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a95251923e8e22f368ffa86ba8bce87ff',1,'cv::THRESH_OTSU'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a95251923e8e22f368ffa86ba8bce87ff',1,'THRESH_OTSU(Global Namespace)']]], - ['thresh_5fto_5fzero_5ffunc_205',['thresh_to_zero_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc4697ee7c3858af0a1be46b15e4d96b',1,'cv::cudev::thresh_to_zero_func()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc4697ee7c3858af0a1be46b15e4d96b',1,'thresh_to_zero_func()(Global Namespace)']]], - ['thresh_5fto_5fzero_5finv_5ffunc_206',['thresh_to_zero_inv_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0122c76ed3e9c6ae3c9029b3024d2900',1,'cv::cudev::thresh_to_zero_inv_func()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0122c76ed3e9c6ae3c9029b3024d2900',1,'thresh_to_zero_inv_func()(Global Namespace)']]], - ['thresh_5ftozero_207',['THRESH_TOZERO',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a0e50a338a4b711a8c48f06a6b105dd98',1,'cv::THRESH_TOZERO'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a0e50a338a4b711a8c48f06a6b105dd98',1,'THRESH_TOZERO(Global Namespace)']]], - ['thresh_5ftozero_5finv_208',['THRESH_TOZERO_INV',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a47518a30aae90d799035bdcf0bb39a50',1,'cv::THRESH_TOZERO_INV'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a47518a30aae90d799035bdcf0bb39a50',1,'THRESH_TOZERO_INV(Global Namespace)']]], - ['thresh_5ftriangle_209',['THRESH_TRIANGLE',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a22ffcf680811aed95be6c7f5cd809621',1,'cv::THRESH_TRIANGLE'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a22ffcf680811aed95be6c7f5cd809621',1,'THRESH_TRIANGLE(Global Namespace)']]], - ['thresh_5ftrunc_210',['THRESH_TRUNC',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576ac7e89a5e95490116e7d2082b3096b2b8',1,'cv::THRESH_TRUNC'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576ac7e89a5e95490116e7d2082b3096b2b8',1,'THRESH_TRUNC(Global Namespace)']]], - ['thresh_5ftrunc_5ffunc_211',['thresh_trunc_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga224099b6a69a04ee5428ba482d77241d',1,'cv::cudev::thresh_trunc_func()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga224099b6a69a04ee5428ba482d77241d',1,'thresh_trunc_func()(Global Namespace)']]], - ['threshbinary_5f_212',['threshBinary_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19e1c2dd5bf79f6ddd854479e4bc58b2',1,'cv::cudev::threshBinary_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19e1c2dd5bf79f6ddd854479e4bc58b2',1,'threshBinary_()(Global Namespace)']]], - ['threshbinaryfunc_213',['ThreshBinaryFunc',['https://docs.opencv.org/4.2.0/df/df5/structcv_1_1cudev_1_1ThreshBinaryFunc.html',1,'cv::cudev']]], - ['threshbinaryinv_5f_214',['threshBinaryInv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga780e0b40b9cc52ccf018a021fedca326',1,'cv::cudev::threshBinaryInv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga780e0b40b9cc52ccf018a021fedca326',1,'threshBinaryInv_()(Global Namespace)']]], - ['threshbinaryinvfunc_215',['ThreshBinaryInvFunc',['https://docs.opencv.org/4.2.0/da/d5e/structcv_1_1cudev_1_1ThreshBinaryInvFunc.html',1,'cv::cudev']]], - ['threshold_216',['threshold',['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#a154e5064920beded03b54bd4e542665f',1,'cv::face::StandardCollector::threshold'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a72276adb1aa11f870f50d0bd58af014d',1,'Eigen::ColPivHouseholderQR::threshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a72276adb1aa11f870f50d0bd58af014d',1,'ColPivHouseholderQR< MatrixType >::threshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a3909f07268496c0f08f1b57331d91075',1,'Eigen::CompleteOrthogonalDecomposition::threshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#af7f6ac15ca19c2b9e45dc3eaae58c201',1,'Eigen::FullPivHouseholderQR::threshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#ad77539203694f2d85ff7d11616e5a0a5',1,'Eigen::FullPivLU::threshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a98b2ee98690358951807353812a05c69',1,'Eigen::SVDBase::threshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a98b2ee98690358951807353812a05c69',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::threshold()']]], - ['threshold_217',['THRESHOLD',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#aeb231abf4b24747a3e2f6ca4d99132caa8d01c1ae87944f51bfc772f7302d7b6d',1,'cv::AgastFeatureDetector::THRESHOLD'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#aadc316b5df92d9e457c9c984f1bab7eea86ae705d0195c26863b5284ffd6a1066',1,'cv::FastFeatureDetector::THRESHOLD']]], - ['threshold_218',['threshold',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gae8a4a146d1ca78c626a53577199e9c57',1,'cv::threshold()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga40f1c94ae9a9456df3cad48e3cb008e1',1,'cv::cuda::threshold()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gad538f94c264624d0ea78b853d53adcb2',1,'cv::gapi::threshold(const GMat &src, const GScalar &thresh, const GScalar &maxval, int type)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga33361fa1e5bdd6201cb23ced85e7eeae',1,'cv::gapi::threshold(const GMat &src, const GScalar &maxval, int type)'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga6c9167cbfe788a52a07f6dd3ef8ca4d9',1,'cv::ximgproc::rl::threshold()'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gae8a4a146d1ca78c626a53577199e9c57',1,'threshold(InputArray src, OutputArray dst, double thresh, double maxval, int type)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gad538f94c264624d0ea78b853d53adcb2',1,'threshold(const GMat &src, const GScalar &thresh, const GScalar &maxval, int type)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga33361fa1e5bdd6201cb23ced85e7eeae',1,'threshold(const GMat &src, const GScalar &maxval, int type)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga40f1c94ae9a9456df3cad48e3cb008e1',1,'threshold(InputArray src, OutputArray dst, double thresh, double maxval, int type, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga6c9167cbfe788a52a07f6dd3ef8ca4d9',1,'threshold(InputArray src, OutputArray rlDest, double thresh, int type)(Global Namespace)']]], - ['threshold_2emarkdown_219',['threshold.markdown',['https://docs.opencv.org/4.2.0/d1/d75/threshold_8markdown.html',1,'']]], - ['threshold_5finrange_2emarkdown_220',['threshold_inRange.markdown',['https://docs.opencv.org/4.2.0/dc/dbe/threshold__inRange_8markdown.html',1,'']]], - ['thresholding_221',['Thresholding',['https://docs.opencv.org/4.2.0/d7/d4d/tutorial_py_thresholding.html',1,'Image Thresholding'],['https://docs.opencv.org/4.2.0/d7/dd0/tutorial_js_thresholding.html',1,'Image Thresholding']]], - ['thresholding_20operations_222',['Basic Thresholding Operations',['https://docs.opencv.org/4.2.0/db/d8e/tutorial_threshold.html',1,'']]], - ['thresholding_20operations_20using_20inrange_223',['Thresholding Operations using inRange',['https://docs.opencv.org/4.2.0/da/d97/tutorial_threshold_inRange.html',1,'']]], - ['thresholdoff_224',['thresholdOFF',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#af72cef13be6c98a37de23c9beb0c816f',1,'cv::bioinspired::SegmentationParameters']]], - ['thresholdon_225',['thresholdON',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#a50eb9d7781953ddd353f54f26ba89603',1,'cv::bioinspired::SegmentationParameters']]], - ['thresholdstep_226',['thresholdStep',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a7fdc3403eb1a826bebc661dd9724faf9',1,'cv::SimpleBlobDetector::Params']]], - ['thresholdtypes_227',['ThresholdTypes',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaa9e58d2860d4afa658ef70a9b1115576',1,'cv::ThresholdTypes'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaa9e58d2860d4afa658ef70a9b1115576',1,'ThresholdTypes(Global Namespace)']]], - ['threshtozero_5f_228',['threshToZero_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fa725bd94ae0675d80a186149761bd',1,'cv::cudev::threshToZero_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fa725bd94ae0675d80a186149761bd',1,'threshToZero_()(Global Namespace)']]], - ['threshtozerofunc_229',['ThreshToZeroFunc',['https://docs.opencv.org/4.2.0/df/dd9/structcv_1_1cudev_1_1ThreshToZeroFunc.html',1,'cv::cudev']]], - ['threshtozeroinv_5f_230',['threshToZeroInv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bff0fcf296b1a1007d95898a3199a5f',1,'cv::cudev::threshToZeroInv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bff0fcf296b1a1007d95898a3199a5f',1,'threshToZeroInv_()(Global Namespace)']]], - ['threshtozeroinvfunc_231',['ThreshToZeroInvFunc',['https://docs.opencv.org/4.2.0/d8/d7e/structcv_1_1cudev_1_1ThreshToZeroInvFunc.html',1,'cv::cudev']]], - ['threshtrunc_5f_232',['threshTrunc_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ec7d1dea5e7e9f7f41e45c6ae231279',1,'cv::cudev::threshTrunc_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ec7d1dea5e7e9f7f41e45c6ae231279',1,'threshTrunc_()(Global Namespace)']]], - ['threshtruncfunc_233',['ThreshTruncFunc',['https://docs.opencv.org/4.2.0/d0/d44/structcv_1_1cudev_1_1ThreshTruncFunc.html',1,'cv::cudev']]], - ['through_234',['Through',['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a7ae0bb22aa49175b46ed58010b8d5221',1,'Eigen::Hyperplane::Through(const VectorType &p0, const VectorType &p1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a23f225bb36b10ce116ca97d2ca7aa345',1,'Eigen::Hyperplane::Through(const VectorType &p0, const VectorType &p1, const VectorType &p2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a9e6c2b409eae9da4f66439fff8d4ffcc',1,'Eigen::ParametrizedLine::Through()']]], - ['throw_2ehpp_235',['throw.hpp',['https://docs.opencv.org/4.2.0/d6/dd8/throw_8hpp.html',1,'']]], - ['throw_5fallocator_2eh_236',['throw_allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01094.html',1,'']]], - ['throw_5fallocator_5fbase_237',['throw_allocator_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10739.html',1,'__gnu_cxx']]], - ['throw_5fallocator_5fbase_3c_20_5ftp_2c_20limit_5fcondition_20_3e_238',['throw_allocator_base< _Tp, limit_condition >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10739.html',1,'']]], - ['throw_5fallocator_5fbase_3c_20_5ftp_2c_20random_5fcondition_20_3e_239',['throw_allocator_base< _Tp, random_condition >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10739.html',1,'']]], - ['throw_5fallocator_5flimit_240',['throw_allocator_limit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10743.html',1,'__gnu_cxx']]], - ['throw_5fallocator_5frandom_241',['throw_allocator_random',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10751.html',1,'__gnu_cxx']]], - ['throw_5ferror_242',['throw_error',['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a40544b3ca23b3917f2a5de6b0273079d',1,'cv::util']]], - ['throw_5fvalue_5fbase_243',['throw_value_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10727.html',1,'__gnu_cxx']]], - ['throw_5fvalue_5fbase_3c_20limit_5fcondition_20_3e_244',['throw_value_base< limit_condition >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10727.html',1,'']]], - ['throw_5fvalue_5fbase_3c_20random_5fcondition_20_3e_245',['throw_value_base< random_condition >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10727.html',1,'']]], - ['throw_5fvalue_5flimit_246',['throw_value_limit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10731.html',1,'__gnu_cxx']]], - ['throw_5fvalue_5frandom_247',['throw_value_random',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10735.html',1,'__gnu_cxx']]], - ['throw_5fwith_5fnested_248',['throw_with_nested',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#gae6e361189fc8333896bebb3523551209',1,'std::throw_with_nested()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#gae6e361189fc8333896bebb3523551209',1,'throw_with_nested()(Global Namespace)']]], - ['throwonfail_249',['throwOnFail',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a8eb39d3c09569c6afe3dc9ef19253219',1,'cv::VideoCapture']]], - ['thrust_250',['Using a cv::cuda::GpuMat with thrust',['https://docs.opencv.org/4.2.0/d8/db9/tutorial_gpu_thrust_interop.html',1,'']]], - ['tickmeter_251',['TickMeter',['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html',1,'cv::TickMeter'],['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html#a3d3b77ba2aa73b05e9c79358ce44eeac',1,'cv::TickMeter::TickMeter()']]], - ['tie_252',['tie',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'basic_ios< char, _Traits >::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'basic_ios< char, _Traits >::tie(basic_ostream< char, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'basic_iostream< char >::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'basic_iostream< char >::tie(basic_ostream< char, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'basic_istream< char >::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'basic_istream< char >::tie(basic_ostream< char, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'basic_istream< char, _Traits >::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'basic_istream< char, _Traits >::tie(basic_ostream< char, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'basic_ostream< char >::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'basic_ostream< char >::tie(basic_ostream< char, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'basic_ostream< char, _Traits >::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'basic_ostream< char, _Traits >::tie(basic_ostream< char, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_fstream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_fstream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_ifstream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_ifstream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_ios::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_ios::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_iostream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_iostream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_istream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_istream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_istringstream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_istringstream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_ofstream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_ofstream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_ostream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_ostream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_ostringstream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_ostringstream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_stringstream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_stringstream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga2445a380e4367c31c737e4a1f1855950',1,'std::tie()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga2445a380e4367c31c737e4a1f1855950',1,'tie()(Global Namespace)']]], - ['tile_5fdim_253',['tile_dim',['https://docs.opencv.org/4.2.0/dd/d44/structcv_1_1cudev_1_1DefaultTransposePolicy.html#aca437e2aaa4d2102c3d7299ff8e14b4da90744d11b53edcf0ae06d4352693be38',1,'cv::cudev::DefaultTransposePolicy']]], - ['tilt_5fang_254',['tilt_ang',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#a0793afa3bb857180365720f6ee9a05ae',1,'cv::datasets::FR_adienceObj']]], - ['time_255',['time',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a1da7e1b7c469ed4ed45d61139cdc043d',1,'std::locale']]], - ['time_256',['Time',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01475.html',1,'']]], - ['time_20measurement_20with_20opencv_257',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], - ['time_20pose_20estimation_20of_20a_20textured_20object_258',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], - ['time_5faffinity_5fw_259',['time_affinity_w',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a371d13dddbd4e89ced1d052931b00afe',1,'cv::tbm::TrackerParams']]], - ['time_5fbase_260',['time_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05975.html',1,'std']]], - ['time_5fget_261',['time_get',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html',1,'std::time_get< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#ad8b2b262581ad71a3ed0011c0381bd51',1,'std::time_get::time_get()']]], - ['time_5fget_5fbyname_262',['time_get_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05991.html',1,'std']]], - ['time_5fmembers_2eh_263',['time_members.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00725.html',1,'']]], - ['time_5fpoint_264',['time_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01843.html',1,'std::chrono']]], - ['time_5fpoint_3c_20_5fclock_2c_20_5fduration_20_3e_265',['time_point< _Clock, _Duration >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01843.html',1,'']]], - ['time_5fpoint_3c_20clock_20_3e_266',['time_point< Clock >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01843.html',1,'std::chrono']]], - ['time_5fpoint_3c_20dataclock_20_3e_267',['time_point< dataclock >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01843.html',1,'std::chrono']]], - ['time_5fpoint_3c_20std_3a_3achrono_3a_3ahigh_5fresolution_5fclock_20_3e_268',['time_point< std::chrono::high_resolution_clock >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01843.html',1,'std::chrono']]], - ['time_5fpoint_5fcast_269',['time_point_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#a313d932abb364aa9f2e206ad2542740a',1,'std::chrono']]], - ['time_5fput_270',['time_put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html',1,'std::time_put< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#af235ae96d55674ae060a1788fd036176',1,'std::time_put::time_put()']]], - ['time_5fput_5fbyname_271',['time_put_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05999.html',1,'std']]], - ['timed_5fmutex_272',['timed_mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02615.html',1,'std']]], - ['timelapser_273',['Timelapser',['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html',1,'cv::detail']]], - ['timelapsercrop_274',['TimelapserCrop',['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1detail_1_1TimelapserCrop.html',1,'cv::detail']]], - ['timelapsers_2ehpp_275',['timelapsers.hpp',['https://docs.opencv.org/4.2.0/d8/d46/timelapsers_8hpp.html',1,'']]], - ['timeout_276',['timeout',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html#gad3ce465ffb10e354aa30c4ce93b68beea90272dda245ae1fb3cf197e91a8689dc',1,'timeout(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4a90272dda245ae1fb3cf197e91a8689dc',1,'timeout(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html#gad3ce465ffb10e354aa30c4ce93b68beea90272dda245ae1fb3cf197e91a8689dc',1,'timeout(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4a90272dda245ae1fb3cf197e91a8689dc',1,'timeout(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html#gad3ce465ffb10e354aa30c4ce93b68beea90272dda245ae1fb3cf197e91a8689dc',1,'timeout(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4a90272dda245ae1fb3cf197e91a8689dc',1,'timeout(Global Namespace)']]], - ['timer_277',['Timer',['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html',1,'cv::ocl::Timer'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#a2f5d362d7f7af2867dd7d07becc7473c',1,'cv::ocl::Timer::Timer()']]], - ['timer_2eh_278',['timer.h',['https://docs.opencv.org/4.2.0/d5/dd0/timer_8h.html',1,'']]], - ['times_279',['times',['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html#a640c7a72e13a81482cc26238e1e86bf5',1,'cv::datasets::SLAM_kittiObj']]], - ['timestamp_280',['timestamp',['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#ab5ab17e11290808695a3b67823ef2fa2',1,'cv::tbm::TrackedObject::timestamp'],['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html#a4a20b4ec8737f5a4e3f1892e472f8fe7',1,'cv::multicalib::MultiCameraCalibration::vertex::timestamp']]], - ['tinyness_5fbefore_281',['tinyness_before',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ad43f706bb453627342a50e9891ae8027',1,'std::__numeric_limits_base::tinyness_before'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ad43f706bb453627342a50e9891ae8027',1,'std::numeric_limits::tinyness_before']]], - ['tl_282',['tl',['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a20dadc5ad7d91a438a4418521760b287',1,'cv::Rect_']]], - ['tlb_5fsize_283',['TLB_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a5685189f3c14bde3fc8857e5217a359d',1,'__gnu_parallel::_Settings']]], - ['tld_5fgetnextdatasetframe_284',['tld_getNextDatasetFrame',['https://docs.opencv.org/4.2.0/db/d13/namespacecv_1_1tld.html#a56b32defe029145b658418171774e2ac',1,'cv::tld']]], - ['tld_5finitdataset_285',['tld_InitDataset',['https://docs.opencv.org/4.2.0/db/d13/namespacecv_1_1tld.html#a334ba88e73c9a20511418d4c71dc00c0',1,'cv::tld']]], - ['tlddataset_2ehpp_286',['tldDataset.hpp',['https://docs.opencv.org/4.2.0/d7/df7/tldDataset_8hpp.html',1,'']]], - ['tls_2ehpp_287',['tls.hpp',['https://docs.opencv.org/4.2.0/d0/d96/tls_8hpp.html',1,'']]], - ['tlsdata_288',['TLSData',['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html',1,'cv::TLSData< T >'],['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#ac945ff66d0653b82b928fa03d2e955cc',1,'cv::TLSData::TLSData()'],['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#ac945ff66d0653b82b928fa03d2e955cc',1,'TLSData< cv::instr::NodeDataTls >::TLSData()']]], - ['tlsdata_3c_20cv_3a_3ainstr_3a_3anodedatatls_20_3e_289',['TLSData< cv::instr::NodeDataTls >',['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html',1,'']]], - ['tlsdataaccumulator_290',['TLSDataAccumulator',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html',1,'cv::TLSDataAccumulator< T >'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a301bbde7e15b617b722fb344183734df',1,'cv::TLSDataAccumulator::TLSDataAccumulator()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a301bbde7e15b617b722fb344183734df',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::TLSDataAccumulator()']]], - ['tlsdataaccumulator_3c_20cv_3a_3ainstr_3a_3anodedatatls_20_3e_291',['TLSDataAccumulator< cv::instr::NodeDataTls >',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html',1,'']]], - ['tlsdatacontainer_292',['TLSDataContainer',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html',1,'cv::TLSDataContainer'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#a822517e9fa810fb1278b6745b666e670',1,'cv::TLSDataContainer::TLSDataContainer()']]], - ['tm_5fccoeff_293',['TM_CCOEFF',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695dac5babb7dfda59544e3e31ea928f8cb16',1,'cv::TM_CCOEFF'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695dac5babb7dfda59544e3e31ea928f8cb16',1,'TM_CCOEFF(Global Namespace)']]], - ['tm_5fccoeff_5fnormed_294',['TM_CCOEFF_NORMED',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695dac6677e2af5e0fae82cc5339bfaef5038',1,'cv::TM_CCOEFF_NORMED'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695dac6677e2af5e0fae82cc5339bfaef5038',1,'TM_CCOEFF_NORMED(Global Namespace)']]], - ['tm_5fccorr_295',['TM_CCORR',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695da5be00b45a4d99b5e42625b4400bfde65',1,'cv::TM_CCORR'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695da5be00b45a4d99b5e42625b4400bfde65',1,'TM_CCORR(Global Namespace)']]], - ['tm_5fccorr_5fnormed_296',['TM_CCORR_NORMED',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695daf9c3ab9296f597ea71f056399a5831da',1,'cv::TM_CCORR_NORMED'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695daf9c3ab9296f597ea71f056399a5831da',1,'TM_CCORR_NORMED(Global Namespace)']]], - ['tm_5fsqdiff_297',['TM_SQDIFF',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695dab65c042ed62c9e9e095a1e7e41fe2773',1,'cv::TM_SQDIFF'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695dab65c042ed62c9e9e095a1e7e41fe2773',1,'TM_SQDIFF(Global Namespace)']]], - ['tm_5fsqdiff_5fnormed_298',['TM_SQDIFF_NORMED',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695da5382c8f9df87e87cf1e9f9927dc3bc31',1,'cv::TM_SQDIFF_NORMED'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695da5382c8f9df87e87cf1e9f9927dc3bc31',1,'TM_SQDIFF_NORMED(Global Namespace)']]], - ['to_299',['to',['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html#a7ee67c4025576238d703f2b51bdcaa51',1,'cv::detail::GraphEdge']]], - ['to_20another_300',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], - ['to_20build_20applications_20with_20opencv_20inside_20the_20microsoft_20visual_20studio_301',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['to_20enable_20halide_20backend_20for_20improve_20efficiency_302',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], - ['to_20find_20a_20known_20object_303',['Features2D + Homography to find a known object',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_feature_homography.html',1,'']]], - ['to_20find_20objects_304',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], - ['to_20functions_305',['to functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html',1,'Adaptors for pointers to functions'],['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'Passing Eigen objects by value to functions']]], - ['to_20java_20development_306',['Introduction to Java Development',['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'']]], - ['to_20members_307',['Adaptors for pointers to members',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01511.html',1,'']]], - ['to_20opencv_308',['to OpenCV',['https://docs.opencv.org/4.2.0/df/d65/tutorial_table_of_content_introduction.html',1,'Introduction to OpenCV'],['https://docs.opencv.org/4.2.0/da/df6/tutorial_py_table_of_contents_setup.html',1,'Introduction to OpenCV']]], - ['to_20opencv_20development_20with_20clojure_309',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], - ['to_20opencv_20js_310',['Introduction to OpenCV.js',['https://docs.opencv.org/4.2.0/df/df7/tutorial_js_table_of_contents_setup.html',1,'']]], - ['to_20opencv_20js_20and_20tutorials_311',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], - ['to_20opencv_20python_20tutorials_312',['Introduction to OpenCV-Python Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'']]], - ['to_20opencv_20tracker_313',['Introduction to OpenCV Tracker',['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'']]], - ['to_20our_20applications_314',['Adding a Trackbar to our applications!',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'']]], - ['to_20principal_20component_20analysis_20pca_315',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], - ['to_20run_20deep_20networks_20in_20browser_316',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], - ['to_20run_20deep_20networks_20on_20android_20device_317',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], - ['to_20scan_20images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_318',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], - ['to_20schedule_20your_20network_20for_20halide_20backend_319',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], - ['to_20sift_20scale_20invariant_20feature_20transform_320',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], - ['to_20support_20vector_20machines_321',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], - ['to_20surf_20speeded_20up_20robust_20features_322',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], - ['to_20the_20facemark_20api_323',['Adding a new algorithm to the Facemark API',['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'']]], - ['to_20track_324',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], - ['to_20use_20background_20subtraction_20methods_325',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], - ['to_20use_20the_20opencv_20parallel_5ffor_5f_20to_20parallelize_20your_20code_326',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], - ['to_20your_20application_327',['Add a Trackbar to Your Application',['https://docs.opencv.org/4.2.0/d5/df3/tutorial_js_trackbar.html',1,'']]], - ['to_20your_20images_328',['Adding borders to your images',['https://docs.opencv.org/4.2.0/dc/da3/tutorial_copyMakeBorder.html',1,'']]], - ['to_5fbson_329',['to_bson',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa62d64781b217372225a0652047d8cf3.html#aa62d64781b217372225a0652047d8cf3',1,'nlohmann::basic_json::to_bson(const basic_json &j)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a668e4c2ad9808218a25879700f4aef2b.html#a668e4c2ad9808218a25879700f4aef2b',1,'nlohmann::basic_json::to_bson(const basic_json &j, detail::output_adapter< uint8_t > o)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9ebed178fb7dad1a574bcb7c361fb1b8.html#a9ebed178fb7dad1a574bcb7c361fb1b8',1,'nlohmann::basic_json::to_bson(const basic_json &j, detail::output_adapter< char > o)']]], - ['to_5fbytes_330',['to_bytes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a5ea01f210ea99aee4fe16eb79b5a5460',1,'std::wstring_convert::to_bytes(_Elem __wchar)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a7a955d4914f3262ae49ad762c63e54ca',1,'std::wstring_convert::to_bytes(const _Elem *__ptr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a9112609c7da47cc6ec1d285d3c3a3498',1,'std::wstring_convert::to_bytes(const wide_string &__wstr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#aa74109db15f1b0b78ac63ef3ed9693f7',1,'std::wstring_convert::to_bytes(const _Elem *__first, const _Elem *__last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a5ea01f210ea99aee4fe16eb79b5a5460',1,'std::wstring_convert::to_bytes(_Elem __wchar)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a7a955d4914f3262ae49ad762c63e54ca',1,'std::wstring_convert::to_bytes(const _Elem *__ptr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a9112609c7da47cc6ec1d285d3c3a3498',1,'std::wstring_convert::to_bytes(const wide_string &__wstr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#aa74109db15f1b0b78ac63ef3ed9693f7',1,'std::wstring_convert::to_bytes(const _Elem *__first, const _Elem *__last)']]], - ['to_5fcbor_331',['to_cbor',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_adabcf74c9c868da3e04a5546b7705af4.html#adabcf74c9c868da3e04a5546b7705af4',1,'nlohmann::basic_json::to_cbor(const basic_json &j)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a2becf604016783e5644eaa7782a08683.html#a2becf604016783e5644eaa7782a08683',1,'nlohmann::basic_json::to_cbor(const basic_json &j, detail::output_adapter< uint8_t > o)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5689672954fd3bc38f2f17e5607064c6.html#a5689672954fd3bc38f2f17e5607064c6',1,'nlohmann::basic_json::to_cbor(const basic_json &j, detail::output_adapter< char > o)']]], - ['to_5fjson_332',['to_json',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1adl__serializer_afdcc8f0204ce8ac7d28a5403f6e1f0e7.html#afdcc8f0204ce8ac7d28a5403f6e1f0e7',1,'nlohmann::adl_serializer::to_json()'],['https://nlohmann.github.io/json/doxygen/namespacenlohmann_1_1anonymous__namespace_02json_8hpp_03_a455d0daa616e67bbb74d81cf3ba15e79.html#a455d0daa616e67bbb74d81cf3ba15e79',1,'nlohmann::anonymous_namespace{json.hpp}::to_json']]], - ['to_5fmsgpack_333',['to_msgpack',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a99b15bcaee410426b937eacc6e47d771.html#a99b15bcaee410426b937eacc6e47d771',1,'nlohmann::basic_json::to_msgpack(const basic_json &j)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa8fe46eda86f6f92c5599c20b6c81819.html#aa8fe46eda86f6f92c5599c20b6c81819',1,'nlohmann::basic_json::to_msgpack(const basic_json &j, detail::output_adapter< uint8_t > o)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aca5dc0fca52131f3a634372120abfbe7.html#aca5dc0fca52131f3a634372120abfbe7',1,'nlohmann::basic_json::to_msgpack(const basic_json &j, detail::output_adapter< char > o)']]], - ['to_5focv_334',['to_ocv',['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a8364ba7dd882bebca8c10b80eb5a9ff4',1,'cv::gapi::own::to_ocv(Mat const &m)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a729faccb5070a1a90945a95de0d3ae61',1,'cv::gapi::own::to_ocv(Mat &&)=delete'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a461b3f83fa19e71d5177ec5f0f832acb',1,'cv::gapi::own::to_ocv(const Scalar &s)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ac18981b6a885b76b6002a7cfed7264f9',1,'cv::gapi::own::to_ocv(const Size &s)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#afd1a94b3ca085818f37ef321e21214d6',1,'cv::gapi::own::to_ocv(const Rect &r)']]], - ['to_5fown_335',['to_own',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a514764b0f88756f12af1bf347fdbdba3',1,'cv::to_own(const cv::MatSize &sz)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#aee7320fdbc6a7a6b6907d0cba8a3f139',1,'cv::to_own(Mat &&)=delete'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#af01116c4ec5866aa63028114b04ba933',1,'cv::to_own(Mat const &m)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a27bb8cf016b95c5593c3d7884766daf5',1,'cv::to_own(const cv::Scalar &s)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a40131c96457013d34cf0986ef0a87581',1,'cv::to_own(const Size &s)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a1abef2827298fc9fa1163b142276a41e',1,'cv::to_own(const Rect &r)']]], - ['to_5fstring_336',['to_string',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a14f4372623ade9d8dde70d1012d647e1',1,'std::bitset::to_string()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a059c2dbeb4277691875b35b2c8409080',1,'std::tr2::dynamic_bitset::to_string()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a3d4b15d32d096e3776c5d2c773b524f5.html#a3d4b15d32d096e3776c5d2c773b524f5',1,'nlohmann::json_pointer::to_string()'],['https://nlohmann.github.io/json/doxygen/namespacenlohmann_a6ce645a0b8717757e096a5b5773b7a16.html#a6ce645a0b8717757e096a5b5773b7a16',1,'nlohmann::to_string()'],['../namespaceutil.html#a38a49bcfa8ed1a20f65a28d004e7af74',1,'util::to_string(const T &val)']]], - ['to_5fstring_3c_20bool_20_3e_337',['to_string< bool >',['../namespaceutil.html#a6b20b0142e53d95a9c4831635f657cb1',1,'util::to_string< bool >(const bool &val)'],['../namespaceutil.html#a6b20b0142e53d95a9c4831635f657cb1',1,'util::to_string< bool >(const bool &val)']]], - ['to_5fubjson_338',['to_ubjson',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a25355b9719db23b189fb5f6a8f4f16c4.html#a25355b9719db23b189fb5f6a8f4f16c4',1,'nlohmann::basic_json::to_ubjson(const basic_json &j, const bool use_size=false, const bool use_type=false)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a19dad92c4fe9e6a289a93195e1230e97.html#a19dad92c4fe9e6a289a93195e1230e97',1,'nlohmann::basic_json::to_ubjson(const basic_json &j, detail::output_adapter< uint8_t > o, const bool use_size=false, const bool use_type=false)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6d133cf7b2e729e9e215edeba5726116.html#a6d133cf7b2e729e9e215edeba5726116',1,'nlohmann::basic_json::to_ubjson(const basic_json &j, detail::output_adapter< char > o, const bool use_size=false, const bool use_type=false)']]], - ['to_5fullong_339',['to_ullong',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab8d0f32ee206f1c1c54a117f6bde02f2',1,'std::tr2::dynamic_bitset']]], - ['to_5fulong_340',['to_ulong',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac43af07a3a1af8d80529ce525eb08716',1,'std::bitset::to_ulong()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a17b163f21c7fc5b28e3925627511e075',1,'std::tr2::dynamic_bitset::to_ulong()']]], - ['toaffine_341',['toAffine',['https://docs.opencv.org/4.2.0/da/d1b/classcv_1_1reg_1_1MapTypeCaster.html#a10b76cf3dcaa5ec7443a1d4c7357884f',1,'cv::reg::MapTypeCaster']]], - ['todensematrix_342',['toDenseMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#addfa91a2c2c69c76159f1091368a505f',1,'Eigen::PermutationBase::toDenseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#addfa91a2c2c69c76159f1091368a505f',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::toDenseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#addfa91a2c2c69c76159f1091368a505f',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::toDenseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#addfa91a2c2c69c76159f1091368a505f',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::toDenseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#addfa91a2c2c69c76159f1091368a505f',1,'PermutationBase< PermutationWrapper< _IndicesType > >::toDenseMatrix()']]], - ['tofilemotionwriter_343',['ToFileMotionWriter',['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html',1,'cv::videostab::ToFileMotionWriter'],['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html#a64568d256f97087b9d0add8e43028573',1,'cv::videostab::ToFileMotionWriter::ToFileMotionWriter()']]], - ['tolerance_344',['tolerance',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#acb442c19b5858d6b9be813dd7d36cc62',1,'Eigen::IterativeSolverBase']]], - ['tolower_345',['tolower',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0ebd233aadf12ec7725b961c469855cf',1,'__ctype_abstract_base< wchar_t >::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a60b8b7de0aed52f3e98e3b4103e088f8',1,'__ctype_abstract_base< wchar_t >::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0ebd233aadf12ec7725b961c469855cf',1,'std::__ctype_abstract_base::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a60b8b7de0aed52f3e98e3b4103e088f8',1,'std::__ctype_abstract_base::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0ebd233aadf12ec7725b961c469855cf',1,'std::ctype::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a60b8b7de0aed52f3e98e3b4103e088f8',1,'std::ctype::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a613ce83b223f740721454f283d168ceb',1,'std::ctype< char >::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aae3c348679b28ff02f655b1ac59d37d9',1,'std::ctype< char >::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0ebd233aadf12ec7725b961c469855cf',1,'std::ctype< wchar_t >::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a60b8b7de0aed52f3e98e3b4103e088f8',1,'std::ctype< wchar_t >::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0ebd233aadf12ec7725b961c469855cf',1,'std::ctype_byname::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a60b8b7de0aed52f3e98e3b4103e088f8',1,'std::ctype_byname::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a613ce83b223f740721454f283d168ceb',1,'std::ctype_byname< char >::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aae3c348679b28ff02f655b1ac59d37d9',1,'std::ctype_byname< char >::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aba2090a5dfff15a593e3fea40eebed91',1,'std::tolower()']]], - ['tolowercase_346',['toLowerCase',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga092419891901d4af43e7c4c2de84b3b2',1,'cv::toLowerCase()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga092419891901d4af43e7c4c2de84b3b2',1,'toLowerCase(const std::string &str)(Global Namespace)']]], - ['tomasi_20corner_20detector_347',['Shi-Tomasi corner detector',['https://docs.opencv.org/4.2.0/d8/dd8/tutorial_good_features_to_track.html',1,'']]], - ['tomasi_20corner_20detector_20good_20features_20to_20track_348',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], - ['tonemap_349',['Tonemap',['https://docs.opencv.org/4.2.0/d8/d5e/classcv_1_1Tonemap.html',1,'cv']]], - ['tonemap_2ehpp_350',['tonemap.hpp',['https://docs.opencv.org/4.2.0/dd/da2/tonemap_8hpp.html',1,'']]], - ['tonemapdrago_351',['TonemapDrago',['https://docs.opencv.org/4.2.0/da/d53/classcv_1_1TonemapDrago.html',1,'cv']]], - ['tonemapdurand_352',['TonemapDurand',['https://docs.opencv.org/4.2.0/d1/db3/classcv_1_1xphoto_1_1TonemapDurand.html',1,'cv::xphoto']]], - ['tonemapmantiuk_353',['TonemapMantiuk',['https://docs.opencv.org/4.2.0/de/d76/classcv_1_1TonemapMantiuk.html',1,'cv']]], - ['tonemapreinhard_354',['TonemapReinhard',['https://docs.opencv.org/4.2.0/d0/dec/classcv_1_1TonemapReinhard.html',1,'cv']]], - ['tools_355',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], - ['top_356',['top',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#adc6f199f89b9bcf05884bcfcf96e18ea',1,'stack< _StateSeqT >::top()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a9dd3184636ea0325d194346266e4e516',1,'stack< _StateSeqT >::top() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#abaedbd99739eef4ac53eefb478eb3900',1,'std::priority_queue::top()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#adc6f199f89b9bcf05884bcfcf96e18ea',1,'std::stack::top()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a9dd3184636ea0325d194346266e4e516',1,'std::stack::top() const']]], - ['top_20level_20format_357',['Top-Level Format',['../cameraconfig.html#toplevel',1,'']]], - ['topics_358',['General topics',['https://eigen.tuxfamily.org/dox/UserManual_Generalities.html',1,'']]], - ['topleft_359',['TopLeft',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a6740871e968264dc5a55248c7f67fb9f',1,'Eigen::AlignedBox']]], - ['topleft_360',['topLeft',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a324326659a263ceaa22b1c4f712ef820',1,'cv::Subdiv2D']]], - ['topleftceil_361',['TopLeftCeil',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378ab174a824f21db60fcbfe0ca1136ed6cf',1,'Eigen::AlignedBox']]], - ['topleftfloor_362',['TopLeftFloor',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a352b1a4b80151a3d8d8b63cbd113e40b',1,'Eigen::AlignedBox']]], - ['topose_363',['toPose',['../namespaceutil.html#afcec0cc3869936542227f6e663ad2892',1,'util']]], - ['topright_364',['TopRight',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378af68213ceced0d7988b2b9200225dcae6',1,'Eigen::AlignedBox']]], - ['toprightceil_365',['TopRightCeil',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a6eb2e279c813983a8bc89f62959be3bd',1,'Eigen::AlignedBox']]], - ['toprightfloor_366',['TopRightFloor',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a7cd9ba0b2da76e88e3e1b11796841383',1,'Eigen::AlignedBox']]], - ['toprojec_367',['toProjec',['https://docs.opencv.org/4.2.0/da/d1b/classcv_1_1reg_1_1MapTypeCaster.html#ab04e6671b186e23fb9347fae7f57bfde',1,'cv::reg::MapTypeCaster']]], - ['toqmatrix_368',['toQMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#adaa35139dce9e7e8e144bbdecf97f63f',1,'Eigen::Transform']]], - ['toqtransform_369',['toQTransform',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ae954e369a06472f44b72b199beb83cd2',1,'Eigen::Transform']]], - ['torotationmatrix_370',['toRotationMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#ad333c1b13aa0fa01d7fab30f18d2cd46',1,'Eigen::AngleAxis::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a8cf07ab9875baba2eecdd62ff93bfc3f',1,'Eigen::QuaternionBase::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a8cf07ab9875baba2eecdd62ff93bfc3f',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a8cf07ab9875baba2eecdd62ff93bfc3f',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a8cf07ab9875baba2eecdd62ff93bfc3f',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a961167d84c8b9a989f2ba8609a6afcaf',1,'Eigen::Rotation2D::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'Eigen::RotationBase::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'RotationBase< AngleAxis< _Scalar >, 3 >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'RotationBase< Derived, 3 >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'RotationBase< Rotation2D< _Scalar >, 2 >::toRotationMatrix()']]], - ['toshift_371',['toShift',['https://docs.opencv.org/4.2.0/da/d1b/classcv_1_1reg_1_1MapTypeCaster.html#aea75482cd7a3db0a0205d5e82c68d49f',1,'cv::reg::MapTypeCaster']]], - ['tostring_372',['toString',['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#af971ba08e7b65ecc2b809866b98f317b',1,'cv::dnn']]], - ['total_373',['total',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a2ccd313e06ba169ca6d45c2457d75ee5',1,'cv::_InputArray::total()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa4d317d43fb0cba9c2503f3c61b866c8',1,'cv::Mat::total() const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a5c506fc8b2cf52375e0d8be26aae0df4',1,'cv::Mat::total(int startDim, int endDim=INT_MAX) const'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a93dbce66072b6125bf87634f230f9470',1,'cv::gapi::own::Mat::total()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#abe7fd91b67cf90aa90c0845572552030',1,'cv::UMat::total()'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a65ad6cf1b64a572bf78d696d2014b0e6',1,'cv::dnn::total()']]], - ['total_5fnum_5fmatches_5f_374',['total_num_matches_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a4f14cdc846f7f03828c1fb6c21539936',1,'cv::detail::BundleAdjusterBase']]], - ['totalconstmem_375',['totalConstMem',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a29400f0d97437a3719bad4bbfda7cf4c',1,'cv::cuda::DeviceInfo']]], - ['totalglobalmem_376',['totalGlobalMem',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#aaf390495658f0b0438c1aa0bac4a2653',1,'cv::cuda::DeviceInfo']]], - ['totalmemory_377',['totalMemory',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ababe3526678da77c83e40e2e3ed00599',1,'cv::cuda::DeviceInfo']]], - ['totransform_378',['toTransform',['../namespaceutil.html#a491b92a3b8414fcfa7ea00bdc9cdcd3e',1,'util']]], - ['totransformrotatefirst_379',['toTransformRotateFirst',['../namespaceutil.html#a1d75d06aaea966512ccaad4538b79101',1,'util']]], - ['toupper_380',['toupper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a3308c7447a3a2c54ab8cb344f502baff',1,'__ctype_abstract_base< wchar_t >::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ae8000f95414789f7a5cba135b3b1e7b8',1,'__ctype_abstract_base< wchar_t >::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a3308c7447a3a2c54ab8cb344f502baff',1,'std::__ctype_abstract_base::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ae8000f95414789f7a5cba135b3b1e7b8',1,'std::__ctype_abstract_base::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a3308c7447a3a2c54ab8cb344f502baff',1,'std::ctype::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ae8000f95414789f7a5cba135b3b1e7b8',1,'std::ctype::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a40a825cf22f673eafcd52ec226982604',1,'std::ctype< char >::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a45aa4603a4e2181084e6f634d83502fc',1,'std::ctype< char >::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a3308c7447a3a2c54ab8cb344f502baff',1,'std::ctype< wchar_t >::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ae8000f95414789f7a5cba135b3b1e7b8',1,'std::ctype< wchar_t >::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a3308c7447a3a2c54ab8cb344f502baff',1,'std::ctype_byname::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ae8000f95414789f7a5cba135b3b1e7b8',1,'std::ctype_byname::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a40a825cf22f673eafcd52ec226982604',1,'std::ctype_byname< char >::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a45aa4603a4e2181084e6f634d83502fc',1,'std::ctype_byname< char >::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4578341d5a9a5b937351d2f976ab7180',1,'std::toupper()']]], - ['touppercase_381',['toUpperCase',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3b25b7019e6fbd24d2ef83231d03c50a',1,'cv::toUpperCase()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3b25b7019e6fbd24d2ef83231d03c50a',1,'toUpperCase(const std::string &str)(Global Namespace)']]], - ['tr1_2fccomplex_382',['tr1/ccomplex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16616.html',1,'']]], - ['tr1_2fcctype_383',['tr1/cctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16619.html',1,'']]], - ['tr1_2fcfenv_384',['tr1/cfenv',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16622.html',1,'']]], - ['tr1_2fcfloat_385',['tr1/cfloat',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16625.html',1,'']]], - ['tr1_2fcinttypes_386',['tr1/cinttypes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16631.html',1,'']]], - ['tr1_2fclimits_387',['tr1/climits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16634.html',1,'']]], - ['tr1_2fcmath_388',['tr1/cmath',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16640.html',1,'']]], - ['tr1_2fcomplex_389',['tr1/complex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16649.html',1,'']]], - ['tr1_2fcstdarg_390',['tr1/cstdarg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16718.html',1,'']]], - ['tr1_2fcstdbool_391',['tr1/cstdbool',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16721.html',1,'']]], - ['tr1_2fcstdint_392',['tr1/cstdint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16724.html',1,'']]], - ['tr1_2fcstdio_393',['tr1/cstdio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16727.html',1,'']]], - ['tr1_2fcstdlib_394',['tr1/cstdlib',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16730.html',1,'']]], - ['tr1_2fctgmath_395',['tr1/ctgmath',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16733.html',1,'']]], - ['tr1_2fctime_396',['tr1/ctime',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16736.html',1,'']]], - ['tr1_2fcwchar_397',['tr1/cwchar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16739.html',1,'']]], - ['tr1_2fcwctype_398',['tr1/cwctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16742.html',1,'']]], - ['tr2_2fratio_399',['tr2/ratio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17180.html',1,'']]], - ['tr2_2ftype_5ftraits_400',['tr2/type_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17327.html',1,'']]], - ['tr_5fchars_401',['TR_chars',['https://docs.opencv.org/4.2.0/d7/dc3/classcv_1_1datasets_1_1TR__chars.html',1,'cv::datasets']]], - ['tr_5fchars_2ehpp_402',['tr_chars.hpp',['https://docs.opencv.org/4.2.0/d0/d93/tr__chars_8hpp.html',1,'']]], - ['tr_5fcharsobj_403',['TR_charsObj',['https://docs.opencv.org/4.2.0/d8/d14/structcv_1_1datasets_1_1TR__charsObj.html',1,'cv::datasets']]], - ['tr_5ficdar_404',['TR_icdar',['https://docs.opencv.org/4.2.0/d7/dfb/classcv_1_1datasets_1_1TR__icdar.html',1,'cv::datasets']]], - ['tr_5ficdar_2ehpp_405',['tr_icdar.hpp',['https://docs.opencv.org/4.2.0/d0/d2b/tr__icdar_8hpp.html',1,'']]], - ['tr_5ficdarobj_406',['TR_icdarObj',['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1datasets_1_1TR__icdarObj.html',1,'cv::datasets']]], - ['tr_5fsvt_407',['TR_svt',['https://docs.opencv.org/4.2.0/da/dc9/classcv_1_1datasets_1_1TR__svt.html',1,'cv::datasets']]], - ['tr_5fsvt_2ehpp_408',['tr_svt.hpp',['https://docs.opencv.org/4.2.0/d7/d32/tr__svt_8hpp.html',1,'']]], - ['tr_5fsvtobj_409',['TR_svtObj',['https://docs.opencv.org/4.2.0/d3/dc5/structcv_1_1datasets_1_1TR__svtObj.html',1,'cv::datasets']]], - ['trace_410',['trace',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#aeae65b9413c8b8b7fd6829ee55558d92',1,'cv::cuda::SURF_CUDA::trace'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a544b609f65eb2bd3e368b3fc2d79479e',1,'Eigen::MatrixBase::trace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a544b609f65eb2bd3e368b3fc2d79479e',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::trace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a544b609f65eb2bd3e368b3fc2d79479e',1,'MatrixBase< Solve< Decomposition, RhsType > >::trace()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga36ad18631177b097a38198c4e83c6e2b',1,'cv::trace(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3419ac19c7dcd2be4bd552a23e147dd8',1,'cv::trace(InputArray mtx)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga36ad18631177b097a38198c4e83c6e2b',1,'trace(const Matx< _Tp, m, n > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3419ac19c7dcd2be4bd552a23e147dd8',1,'trace(InputArray mtx)(Global Namespace)']]], - ['trace_2ehpp_411',['trace.hpp',['https://docs.opencv.org/4.2.0/d4/db9/trace_8hpp.html',1,'']]], - ['trace_2eprivate_2ehpp_412',['trace.private.hpp',['https://docs.opencv.org/4.2.0/df/db6/trace_8private_8hpp.html',1,'']]], - ['track_413',['Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'Shi-Tomasi Corner Detector & Good Features to Track'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html',1,'cv::tbm::Track'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a98f7c220b57a604f4c5aad93efe64229',1,'cv::tbm::Track::Track()']]], - ['track_5falov_414',['TRACK_alov',['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html',1,'cv::datasets']]], - ['track_5falov_2ehpp_415',['track_alov.hpp',['https://docs.opencv.org/4.2.0/d7/ddc/track__alov_8hpp.html',1,'']]], - ['track_5falovobj_416',['TRACK_alovObj',['https://docs.opencv.org/4.2.0/dd/d88/structcv_1_1datasets_1_1TRACK__alovObj.html',1,'cv::datasets']]], - ['track_5fvot_417',['TRACK_vot',['https://docs.opencv.org/4.2.0/dc/d52/classcv_1_1datasets_1_1TRACK__vot.html',1,'cv::datasets']]], - ['track_5fvot_2ehpp_418',['track_vot.hpp',['https://docs.opencv.org/4.2.0/d2/dd7/track__vot_8hpp.html',1,'']]], - ['track_5fvotobj_419',['TRACK_votObj',['https://docs.opencv.org/4.2.0/d9/d36/structcv_1_1datasets_1_1TRACK__votObj.html',1,'cv::datasets']]], - ['trackbar_20as_20the_20color_20palette_420',['Trackbar as the Color Palette',['https://docs.opencv.org/4.2.0/d9/dc8/tutorial_py_trackbar.html',1,'']]], - ['trackbar_20to_20our_20applications_421',['Adding a Trackbar to our applications!',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'']]], - ['trackbar_20to_20your_20application_422',['Add a Trackbar to Your Application',['https://docs.opencv.org/4.2.0/d5/df3/tutorial_js_trackbar.html',1,'']]], - ['trackbar_2emarkdown_423',['trackbar.markdown',['https://docs.opencv.org/4.2.0/d5/ddb/trackbar_8markdown.html',1,'']]], - ['trackbarcallback_424',['TrackbarCallback',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga004b512c3d09aa53f20b050b1d01fab1',1,'cv::TrackbarCallback'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga004b512c3d09aa53f20b050b1d01fab1',1,'TrackbarCallback(Global Namespace)']]], - ['tracked_5fcv_5fmat_425',['tracked_cv_mat',['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html',1,'cv::detail::tracked_cv_mat'],['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a0e888f5713607939a67c05f152cdaf83',1,'cv::detail::tracked_cv_mat::tracked_cv_mat()']]], - ['tracked_5fcv_5fumat_426',['tracked_cv_umat',['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html',1,'cv::detail::tracked_cv_umat'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a2d3d1aba90a40aa411eea051e686df35',1,'cv::detail::tracked_cv_umat::tracked_cv_umat()']]], - ['trackeddetections_427',['trackedDetections',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a5210e61b845eda2e0c0d3ba3439ae94f',1,'cv::tbm::ITrackerByMatching']]], - ['trackedobject_428',['TrackedObject',['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html',1,'cv::DetectionBasedTracker::TrackedObject'],['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html',1,'cv::tbm::TrackedObject'],['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#a3a4e43e054437af34261cb1e6717cdf6',1,'cv::tbm::TrackedObject::TrackedObject()'],['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#a2518f3d70b697de91337223101d92209',1,'cv::tbm::TrackedObject::TrackedObject(const cv::Rect &rect, float confidence, int frame_idx, int object_id)'],['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#a5538f31afacbf3bde785b76db37f6813',1,'cv::DetectionBasedTracker::TrackedObject::TrackedObject()']]], - ['trackedobjects_429',['trackedObjects',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#adc0f343e0a2f0515b15f3ecdb7e59069',1,'cv::DetectionBasedTracker']]], - ['trackedobjects_430',['TrackedObjects',['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#ac9cf53102cb7b1485da7d9814dbb40e8',1,'cv::tbm']]], - ['tracker_431',['Tracker',['https://docs.opencv.org/4.2.0/dc/db8/tutorial_customizing_cn_tracker.html',1,'Customizing the CN Tracker'],['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'Introduction to OpenCV Tracker'],['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html',1,'cv::Tracker']]], - ['tracker_2ehpp_432',['tracker.hpp',['https://docs.opencv.org/4.2.0/df/ddd/tracker_8hpp.html',1,'']]], - ['trackeradaboostingtargetstate_433',['TrackerAdaBoostingTargetState',['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerAdaBoostingTargetState'],['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html#a20ea2d9eab4ed16c8e07e99be117f66a',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerAdaBoostingTargetState::TrackerAdaBoostingTargetState()']]], - ['trackerboosting_434',['TrackerBoosting',['https://docs.opencv.org/4.2.0/d1/d1a/classcv_1_1TrackerBoosting.html',1,'cv']]], - ['trackercsrt_435',['TrackerCSRT',['https://docs.opencv.org/4.2.0/d2/da2/classcv_1_1TrackerCSRT.html',1,'cv']]], - ['trackerfeature_436',['TrackerFeature',['https://docs.opencv.org/4.2.0/d7/da2/classcv_1_1TrackerFeature.html',1,'cv']]], - ['trackerfeaturefeature2d_437',['TrackerFeatureFeature2d',['https://docs.opencv.org/4.2.0/d3/d4c/classcv_1_1TrackerFeatureFeature2d.html',1,'cv::TrackerFeatureFeature2d'],['https://docs.opencv.org/4.2.0/d3/d4c/classcv_1_1TrackerFeatureFeature2d.html#a703af7a26bade35145058687d9c0a5f2',1,'cv::TrackerFeatureFeature2d::TrackerFeatureFeature2d()']]], - ['trackerfeaturehaar_438',['TrackerFeatureHAAR',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html',1,'cv::TrackerFeatureHAAR'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a17316b00397376d9b3ad8a19b612cc9b',1,'cv::TrackerFeatureHAAR::TrackerFeatureHAAR()']]], - ['trackerfeaturehog_439',['TrackerFeatureHOG',['https://docs.opencv.org/4.2.0/d2/da3/classcv_1_1TrackerFeatureHOG.html',1,'cv::TrackerFeatureHOG'],['https://docs.opencv.org/4.2.0/d2/da3/classcv_1_1TrackerFeatureHOG.html#a837747c102d32f97c9b4280657eb75e6',1,'cv::TrackerFeatureHOG::TrackerFeatureHOG()']]], - ['trackerfeaturelbp_440',['TrackerFeatureLBP',['https://docs.opencv.org/4.2.0/dc/d73/classcv_1_1TrackerFeatureLBP.html',1,'cv::TrackerFeatureLBP'],['https://docs.opencv.org/4.2.0/dc/d73/classcv_1_1TrackerFeatureLBP.html#a852ac4abc8b33fc7b421b6638cf029d3',1,'cv::TrackerFeatureLBP::TrackerFeatureLBP()']]], - ['trackerfeatureset_441',['TrackerFeatureSet',['https://docs.opencv.org/4.2.0/dc/da7/classcv_1_1TrackerFeatureSet.html',1,'cv::TrackerFeatureSet'],['https://docs.opencv.org/4.2.0/dc/da7/classcv_1_1TrackerFeatureSet.html#a0c37dc963ae8d7d3a98f6876f04706c5',1,'cv::TrackerFeatureSet::TrackerFeatureSet()']]], - ['trackergoturn_442',['TrackerGOTURN',['https://docs.opencv.org/4.2.0/d7/d4c/classcv_1_1TrackerGOTURN.html',1,'cv']]], - ['trackerkcf_443',['TrackerKCF',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html',1,'cv']]], - ['trackerlist_444',['trackerList',['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html#af5ee90c1a31b1277eb7eef8919359ddb',1,'cv::MultiTracker']]], - ['trackermedianflow_445',['TrackerMedianFlow',['https://docs.opencv.org/4.2.0/d7/d86/classcv_1_1TrackerMedianFlow.html',1,'cv']]], - ['trackermil_446',['TrackerMIL',['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1TrackerMIL.html',1,'cv']]], - ['trackermiltargetstate_447',['TrackerMILTargetState',['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html',1,'cv::TrackerStateEstimatorMILBoosting::TrackerMILTargetState'],['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html#a84c69f72b10ac8d276d222d1c92e6e44',1,'cv::TrackerStateEstimatorMILBoosting::TrackerMILTargetState::TrackerMILTargetState()']]], - ['trackermodel_448',['TrackerModel',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html',1,'cv::TrackerModel'],['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a1c015b807dc8e37ba2d92550363a033f',1,'cv::TrackerModel::TrackerModel()']]], - ['trackermosse_449',['TrackerMOSSE',['https://docs.opencv.org/4.2.0/d0/d02/classcv_1_1TrackerMOSSE.html',1,'cv']]], - ['trackerparams_450',['TrackerParams',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html',1,'cv::tbm::TrackerParams'],['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#aa9428b99cbfee32741e9a6ae498e38c8',1,'cv::tbm::TrackerParams::TrackerParams()']]], - ['trackers_451',['trackers',['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html#a6d69d89c30a0cfc317c1dadc6b480bab',1,'cv::MultiTracker_Alt']]], - ['trackersampler_452',['TrackerSampler',['https://docs.opencv.org/4.2.0/da/d76/classcv_1_1TrackerSampler.html',1,'cv::TrackerSampler'],['https://docs.opencv.org/4.2.0/da/d76/classcv_1_1TrackerSampler.html#aaf7aae2c4a3df9427a957d8b2d28a499',1,'cv::TrackerSampler::TrackerSampler()']]], - ['trackersampleralgorithm_453',['TrackerSamplerAlgorithm',['https://docs.opencv.org/4.2.0/dc/d75/classcv_1_1TrackerSamplerAlgorithm.html',1,'cv']]], - ['trackersamplercs_454',['TrackerSamplerCS',['https://docs.opencv.org/4.2.0/da/d3e/classcv_1_1TrackerSamplerCS.html',1,'cv::TrackerSamplerCS'],['https://docs.opencv.org/4.2.0/da/d3e/classcv_1_1TrackerSamplerCS.html#a017cb90f5a6592928ac1dcd86e7d1dfc',1,'cv::TrackerSamplerCS::TrackerSamplerCS()']]], - ['trackersamplercsc_455',['TrackerSamplerCSC',['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html',1,'cv::TrackerSamplerCSC'],['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#a5cfe4dfb888d22686b8b45f944aff943',1,'cv::TrackerSamplerCSC::TrackerSamplerCSC()']]], - ['trackersamplerpf_456',['TrackerSamplerPF',['https://docs.opencv.org/4.2.0/d3/df4/classcv_1_1TrackerSamplerPF.html',1,'cv::TrackerSamplerPF'],['https://docs.opencv.org/4.2.0/d3/df4/classcv_1_1TrackerSamplerPF.html#a841af709375362b4b8811721a0e9503a',1,'cv::TrackerSamplerPF::TrackerSamplerPF()']]], - ['trackerstateestimator_457',['TrackerStateEstimator',['https://docs.opencv.org/4.2.0/d2/db9/classcv_1_1TrackerStateEstimator.html',1,'cv']]], - ['trackerstateestimatoradaboosting_458',['TrackerStateEstimatorAdaBoosting',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html',1,'cv::TrackerStateEstimatorAdaBoosting'],['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a6c43e5c3c3e906c0b79cac31e00b6b13',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerStateEstimatorAdaBoosting()']]], - ['trackerstateestimatormilboosting_459',['TrackerStateEstimatorMILBoosting',['https://docs.opencv.org/4.2.0/d9/d20/classcv_1_1TrackerStateEstimatorMILBoosting.html',1,'cv::TrackerStateEstimatorMILBoosting'],['https://docs.opencv.org/4.2.0/d9/d20/classcv_1_1TrackerStateEstimatorMILBoosting.html#a9e454fd351a8f9b8caef49b978484eea',1,'cv::TrackerStateEstimatorMILBoosting::TrackerStateEstimatorMILBoosting()']]], - ['trackerstateestimatorsvm_460',['TrackerStateEstimatorSVM',['https://docs.opencv.org/4.2.0/d3/db6/classcv_1_1TrackerStateEstimatorSVM.html',1,'cv::TrackerStateEstimatorSVM'],['https://docs.opencv.org/4.2.0/d3/db6/classcv_1_1TrackerStateEstimatorSVM.html#aea9bbd162707647655db5b5ed8332096',1,'cv::TrackerStateEstimatorSVM::TrackerStateEstimatorSVM()']]], - ['trackertargetstate_461',['TrackerTargetState',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html',1,'cv']]], - ['trackertld_462',['TrackerTLD',['https://docs.opencv.org/4.2.0/dc/d1c/classcv_1_1TrackerTLD.html',1,'cv']]], - ['tracking_463',['AKAZE and ORB planar tracking',['https://docs.opencv.org/4.2.0/dc/d16/tutorial_akaze_tracking.html',1,'']]], - ['tracking_464',['Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'Motion Analysis and Object Tracking'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html',1,'Object Tracking'],['https://docs.opencv.org/4.2.0/db/dc1/group__datasets__track.html',1,'Tracking']]], - ['tracking_20api_465',['Tracking API',['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html',1,'']]], - ['tracking_2ehpp_466',['tracking.hpp',['https://docs.opencv.org/4.2.0/d4/dc2/modules_2video_2include_2opencv2_2video_2tracking_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d89/contrib_2modules_2tracking_2include_2opencv2_2tracking_2tracking_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/df6/contrib_2modules_2tracking_2include_2opencv2_2tracking_8hpp.html',1,'(Global Namespace)']]], - ['tracking_5fby_5fmatching_2ehpp_467',['tracking_by_matching.hpp',['https://docs.opencv.org/4.2.0/d1/db4/tracking__by__matching_8hpp.html',1,'']]], - ['trackinposrad_468',['trackInPosRad',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#ae38f48d4fc1ce5f9ba0b3f75c9354dff',1,'cv::TrackerSamplerCSC::Params']]], - ['trackmaxnegnum_469',['trackMaxNegNum',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a2912ff1c644f4ec602879cedccbc8c4f',1,'cv::TrackerSamplerCSC::Params']]], - ['trackmaxposnum_470',['trackMaxPosNum',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a15e2f02065086fcdc15890d276faed0a',1,'cv::TrackerSamplerCSC::Params']]], - ['tracks_471',['tracks',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a8a7fbc87af8a1b7211828fad8b291b76',1,'cv::tbm::ITrackerByMatching']]], - ['train_472',['train',['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html#a0abc96e50f11e025838150fde8ab8595',1,'cv::datasets::Dataset::train'],['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html#a79c1d836e7168c43d85b754414047202',1,'cv::line_descriptor::BinaryDescriptorMatcher::train()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a80e9fd98de5908f5348c17696eeb1a32',1,'cv::DescriptorMatcher::train()'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#ab220b434f827962455f430a12c65c074',1,'cv::cuda::DescriptorMatcher::train()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#ac8680c2aa9649ad3f55e27761165c0d6',1,'cv::face::FaceRecognizer::train()'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a4fc9f506ff3185caa168b937c4e71080',1,'cv::FlannBasedMatcher::train()'],['https://docs.opencv.org/4.2.0/da/dfe/classcv_1_1optflow_1_1GPCForest.html#acbb90d36fd7d96b7bc60949645a3a9bf',1,'cv::optflow::GPCForest::train(GPCTrainingSamples &samples, const GPCTrainingParams params=GPCTrainingParams())'],['https://docs.opencv.org/4.2.0/da/dfe/classcv_1_1optflow_1_1GPCForest.html#a7c847534dbb3d1064bdf183bfb6c8cfa',1,'cv::optflow::GPCForest::train(const std::vector< String > &imagesFrom, const std::vector< String > &imagesTo, const std::vector< String > &gt, const GPCTrainingParams params=GPCTrainingParams())'],['https://docs.opencv.org/4.2.0/da/dfe/classcv_1_1optflow_1_1GPCForest.html#ad31b607375a4fee8cdfc38d2fe826d11',1,'cv::optflow::GPCForest::train(InputArrayOfArrays imagesFrom, InputArrayOfArrays imagesTo, InputArrayOfArrays gt, const GPCTrainingParams params=GPCTrainingParams())'],['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#a841c5d9457e3b43a55cc514698f460d6',1,'cv::optflow::GPCTree::train()'],['https://docs.opencv.org/4.2.0/d9/d5c/classcv_1_1face_1_1MACE.html#a4ab56e17bdbbe6727a7f9adc8895d25d',1,'cv::face::MACE::train()'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af96a0e04f1677a835cc25263c7db3c0c',1,'cv::ml::StatModel::train(const Ptr< TrainData > &trainData, int flags=0)'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#aeb25a75f438864fb25af182fb4b1b96f',1,'cv::ml::StatModel::train(InputArray samples, int layout, InputArray responses)'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af93a21ea5866cd305936a03742f69af8',1,'cv::ml::StatModel::train(const Ptr< TrainData > &data, int flags=0)'],['https://docs.opencv.org/4.2.0/de/d0e/classcv_1_1xobjdetect_1_1WBDetector.html#a3720fb425a2d16f6cd0625a2d8bc563e',1,'cv::xobjdetect::WBDetector::train()']]], - ['train_5ferror_473',['TRAIN_ERROR',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggae5b308134f67997a42e5ca48c2713bcbadbd34852ad37a296e9ecff30b252ec69',1,'cv::ml::TRAIN_ERROR'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggae5b308134f67997a42e5ca48c2713bcbadbd34852ad37a296e9ecff30b252ec69',1,'TRAIN_ERROR(Global Namespace)']]], - ['trainauto_474',['trainAuto',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a533d3d3f950fed3f75be0d8692eeff58',1,'cv::ml::SVM::trainAuto(const Ptr< TrainData > &data, int kFold=10, ParamGrid Cgrid=getDefaultGrid(C), ParamGrid gammaGrid=getDefaultGrid(GAMMA), ParamGrid pGrid=getDefaultGrid(P), ParamGrid nuGrid=getDefaultGrid(NU), ParamGrid coeffGrid=getDefaultGrid(COEF), ParamGrid degreeGrid=getDefaultGrid(DEGREE), bool balanced=false)=0'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a4ce36fa4ff20944f24554d8ddd1f1fbf',1,'cv::ml::SVM::trainAuto(InputArray samples, int layout, InputArray responses, int kFold=10, Ptr< ParamGrid > Cgrid=SVM::getDefaultGridPtr(SVM::C), Ptr< ParamGrid > gammaGrid=SVM::getDefaultGridPtr(SVM::GAMMA), Ptr< ParamGrid > pGrid=SVM::getDefaultGridPtr(SVM::P), Ptr< ParamGrid > nuGrid=SVM::getDefaultGridPtr(SVM::NU), Ptr< ParamGrid > coeffGrid=SVM::getDefaultGridPtr(SVM::COEF), Ptr< ParamGrid > degreeGrid=SVM::getDefaultGridPtr(SVM::DEGREE), bool balanced=false)=0']]], - ['traincascade_2emarkdown_475',['traincascade.markdown',['https://docs.opencv.org/4.2.0/d1/deb/traincascade_8markdown.html',1,'']]], - ['trainclassifier_476',['trainClassifier',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html#aa84a52ea4fcabc47d73ef06a78fd5160',1,'cv::BaseClassifier']]], - ['traindata_477',['TrainData',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html',1,'cv::ml']]], - ['traindesccollection_478',['trainDescCollection',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a6c1d27bb1cea2a46e0a5c7d297368edd',1,'cv::DescriptorMatcher']]], - ['traine_479',['trainE',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a2d02b45a574d51a72263e9c53cdc4f09',1,'cv::ml::EM']]], - ['trainem_480',['trainEM',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a5a6a7badbc0c85a8c9fa50a41bf1bcd2',1,'cv::ml::EM']]], - ['trainflags_481',['TrainFlags',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#afb51e414f22dd69f281a569145ccfad7',1,'cv::ml::ANN_MLP']]], - ['trainidx_482',['trainIdx',['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#a2320bcc822280c8a416b85f80f5a4453',1,'cv::DMatch']]], - ['training_483',['Cascade Classifier Training',['https://docs.opencv.org/4.2.0/dc/d88/tutorial_traincascade.html',1,'']]], - ['training_484',['training',['https://docs.opencv.org/4.2.0/d2/d59/tutorial_ximgproc_training.html',1,'Structured forest training'],['https://docs.opencv.org/4.2.0/dc/de0/classcv_1_1face_1_1FacemarkKazemi.html#a7a1e85e9d726ac0f7ea4ad20b8f68f09',1,'cv::face::FacemarkKazemi::training()'],['https://docs.opencv.org/4.2.0/d3/d81/classcv_1_1face_1_1FacemarkTrain.html#adde846fe7b183b963a4ef04bc7d8d98c',1,'cv::face::FacemarkTrain::training()']]], - ['training_20data_20generation_20using_20icosphere_485',['Training data generation using Icosphere',['https://docs.opencv.org/4.2.0/d6/df4/tutorial_data_generation.html',1,'']]], - ['training_20model_20analysis_486',['Training Model Analysis',['https://docs.opencv.org/4.2.0/d8/d09/tutorial_model_analysis.html',1,'']]], - ['training_20the_20learning_20based_20white_20balance_20algorithm_487',['Training the learning-based white balance algorithm',['https://docs.opencv.org/4.2.0/dc/dcb/tutorial_xphoto_training_white_balance.html',1,'']]], - ['training_2emarkdown_488',['training.markdown',['https://docs.opencv.org/4.2.0/d9/d80/training_8markdown.html',1,'']]], - ['training_5fwhite_5fbalance_2emarkdown_489',['training_white_balance.markdown',['https://docs.opencv.org/4.2.0/dc/d78/training__white__balance_8markdown.html',1,'']]], - ['trainingmethods_490',['TrainingMethods',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a012b34ee340b5d4d11b6844e12816181',1,'cv::ml::ANN_MLP']]], - ['trainm_491',['trainM',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ac21fbae3a09972de0a0a1cb4c2c434d0',1,'cv::ml::EM']]], - ['trainmodel_492',['trainModel',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#acd125802f8339b1ecb67316318a4670d',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['traitas_493',['TraitAs',['https://docs.opencv.org/4.2.0/d1/dae/namespacecv_1_1gapi_1_1ie.html#af63f38e596d0a0c4a2196532cfba3c1b',1,'cv::gapi::ie']]], - ['traits_494',['Traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01540.html',1,'']]], - ['traits_2ehpp_495',['traits.hpp',['https://docs.opencv.org/4.2.0/d9/deb/modules_2core_2include_2opencv2_2core_2traits_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d94/contrib_2modules_2cudev_2include_2opencv2_2cudev_2ptr2d_2traits_8hpp.html',1,'(Global Namespace)']]], - ['traits_5ftype_496',['traits_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2ce652e072a7f6664c71548df3e43af4',1,'basic_ios< char, _Traits >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2ce652e072a7f6664c71548df3e43af4',1,'basic_ios< char, _Traits >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'basic_streambuf< _Elem, _Tr >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'basic_streambuf< _Elem, _Tr >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'basic_streambuf< char, _Traits >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'basic_streambuf< char, _Traits >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'basic_streambuf< char, char_traits< char > >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'basic_streambuf< char, char_traits< char > >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2ce652e072a7f6664c71548df3e43af4',1,'std::basic_ios::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2ce652e072a7f6664c71548df3e43af4',1,'std::basic_ios::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02491.html#a6b50f58dfa1c21836890bd40ec2a3300',1,'std::basic_istream::sentry::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'std::basic_streambuf::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'std::basic_streambuf::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#aba59a766c14f4ae3a89119edd0c82baa',1,'std::istreambuf_iterator::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#aba59a766c14f4ae3a89119edd0c82baa',1,'std::istreambuf_iterator::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a5074fdcc3b49fe7a05c5689d04ab1033',1,'std::ostream_iterator::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a5074fdcc3b49fe7a05c5689d04ab1033',1,'std::ostream_iterator::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#a298c8f26e6abe6243ca62e48f96e8c30',1,'std::ostreambuf_iterator::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#a298c8f26e6abe6243ca62e48f96e8c30',1,'std::ostreambuf_iterator::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'std::wbuffer_convert::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'std::wbuffer_convert::traits_type']]], - ['trajectory_497',['trajectory',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a7b30af308fd4b1a49a76ae20a75435f1',1,'cv::TrackerModel']]], - ['trajectory_498',['Trajectory',['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga390cb8877f3f95b8e2f87e6ee595dfdd',1,'cv::Trajectory'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga390cb8877f3f95b8e2f87e6ee595dfdd',1,'Trajectory(Global Namespace)']]], - ['transf_499',['transf',['https://docs.opencv.org/4.2.0/d2/d71/classcv_1_1xfeatures2d_1_1Elliptic__KeyPoint.html#a37c3b9b67b41ba9e1306ef19085c0f3a',1,'cv::xfeatures2d::Elliptic_KeyPoint']]], - ['transform_500',['Discrete Fourier Transform',['https://docs.opencv.org/4.2.0/d8/d01/tutorial_discrete_fourier_transform.html',1,'']]], - ['transform_501',['Filtering using F-transform',['https://docs.opencv.org/4.2.0/d3/d1d/tutorial_fuzzy_filtering.html',1,'']]], - ['transform_502',['Transform',['https://docs.opencv.org/4.2.0/de/dbc/tutorial_py_fourier_transform.html',1,'Fourier Transform'],['https://docs.opencv.org/4.2.0/dd/d02/tutorial_js_fourier_transform.html',1,'Fourier Transform'],['https://docs.opencv.org/4.2.0/d4/d70/tutorial_hough_circle.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/da/d53/tutorial_py_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d3/de5/tutorial_js_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d9/db0/tutorial_hough_lines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d6/d10/tutorial_py_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d3/de6/tutorial_js_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html',1,'Hough Transform']]], - ['transform_503',['Inpainting using F-transform',['https://docs.opencv.org/4.2.0/d3/db8/tutorial_fuzzy_inpainting.html',1,'']]], - ['transform_504',['Transform',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'Introduction to SIFT (Scale-Invariant Feature Transform)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html',1,'Eigen::Transform< class, _Dim, _Mode, _Options >']]], - ['transform_505',['transform',['https://docs.opencv.org/4.2.0/df/db0/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1edge.html#ad0f9bd42b52a957f40d737b8e0f9a76b',1,'cv::multicalib::MultiCameraCalibration::edge::transform'],['https://docs.opencv.org/4.2.0/df/d29/classcv_1_1cuda_1_1LookUpTable.html#afdbcbd3047f847451892f3b18cd018de',1,'cv::cuda::LookUpTable::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#af4d286d995ec6ff200854960c15b78c8',1,'regex_traits< _CharType >::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ada536ca81b2869cfe04ccb92bc42282e',1,'std::collate::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ada536ca81b2869cfe04ccb92bc42282e',1,'std::collate_byname::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#af4d286d995ec6ff200854960c15b78c8',1,'std::regex_traits::transform()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ab078178e1abfbd078b27ade489b93303',1,'Eigen::AlignedBox::transform(const Transform< Scalar, AmbientDimAtCompileTime, Mode, Options > &transform)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#aa39225243d4aca173391c0bb24d89b46',1,'Eigen::AlignedBox::transform(const typename Transform< Scalar, AmbientDimAtCompileTime, Mode, Options >::TranslationType &translation)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ae89b4a512bfb4acbf6192b37c89d1552',1,'Eigen::Hyperplane::transform(const MatrixBase< XprType > &mat, TransformTraits traits=Affine)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ae07794d268e45fd513a17c49b9a6ec81',1,'Eigen::Hyperplane::transform(const Transform< Scalar, AmbientDimAtCompileTime, Affine, TrOptions > &t, TransformTraits traits=Affine)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a1c2a0ceacef80e76b71f56992a721e6a',1,'Eigen::ParametrizedLine::transform(const MatrixBase< XprType > &mat, TransformTraits traits=Affine)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a09d711ff37c2f421c65f398b9c7120b1',1,'Eigen::ParametrizedLine::transform(const Transform< Scalar, AmbientDimAtCompileTime, Affine, TrOptions > &t, TransformTraits traits=Affine)'],['../classrobot_1_1types_1_1DataPoint.html#a8650e0e36ef570694b8cddd666c12b9e',1,'robot::types::DataPoint::transform()']]], - ['transform_506',['Transform',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a19d71151dfbbe89db15961c93726dd70',1,'Eigen::Transform::Transform()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aec37de6bc74c0769dc4e47ba759bf9ec',1,'Eigen::Transform::Transform(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a83d61d4a1bd1c502c97ad67f87d55006',1,'Eigen::Transform::Transform(const QMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a63e9a5b9cf964921c24023dd680dee6d',1,'Eigen::Transform::Transform(const QTransform &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a2c3e732625ec300ef4e4cb1e17a82d35',1,'Eigen::Transform::Transform(const Transform< OtherScalarType, Dim, Mode, Options > &other)']]], - ['transform_507',['transform',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga393164aa54bb9169ce0a8cc44e08ff22',1,'cv::transform()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga393164aa54bb9169ce0a8cc44e08ff22',1,'transform()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga475f12632a75f77b41aa843dfddfe422',1,'std::transform(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _UnaryOperation __unary_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga92e41473c3907d39cbc98ab6bea346fe',1,'std::transform(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _OutputIterator __result, _BinaryOperation __binary_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga475f12632a75f77b41aa843dfddfe422',1,'transform(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _UnaryOperation __unary_op)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga92e41473c3907d39cbc98ab6bea346fe',1,'transform(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _OutputIterator __result, _BinaryOperation __binary_op)(Global Namespace)']]], - ['transform_20and_20watershed_20algorithm_508',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], - ['transform_20support_509',['transform support',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html',1,'Math with F0-transform support'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html',1,'Math with F1-transform support']]], - ['transform_20theory_510',['F-transform theory',['https://docs.opencv.org/4.2.0/db/daf/tutorial_fuzzy_theory.html',1,'']]], - ['transform_2ehpp_511',['transform.hpp',['https://docs.opencv.org/4.2.0/da/da3/modules_2core_2include_2opencv2_2core_2cuda_2transform_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/df5/contrib_2modules_2cudev_2include_2opencv2_2cudev_2grid_2transform_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d14/contrib_2modules_2cudev_2include_2opencv2_2cudev_2ptr2d_2transform_8hpp.html',1,'(Global Namespace)']]], - ['transform_5fbboxes_512',['transform_bboxes',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a0e8ce822b1e0f50026fabd6492feeaa7',1,'cv::dnn_objdetect::InferBbox']]], - ['transform_5fbboxes_5finv_513',['transform_bboxes_inv',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a43a0eefb42e9c57c5de9cb976a41e3a4',1,'cv::dnn_objdetect::InferBbox']]], - ['transform_5fminimal_5fn_514',['transform_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#aebdcc2cdd7ed5932001f979f6cd1167c',1,'__gnu_parallel::_Settings']]], - ['transform_5fprimary_515',['transform_primary',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a31b5b84c5919d3fd0658cf8c18df0160',1,'regex_traits< _CharType >::transform_primary()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a31b5b84c5919d3fd0658cf8c18df0160',1,'std::regex_traits::transform_primary()']]], - ['transformation_516',['transformation',['https://docs.opencv.org/4.2.0/db/d1f/classcv_1_1GTransformImpl_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#ad8a474251aeaec92fa67bf0fe0353e41',1,'cv::GTransformImpl< K, std::function< R(Args...)> >']]], - ['transformations_517',['Transformations',['https://docs.opencv.org/4.2.0/d4/d61/tutorial_warp_affine.html',1,'Affine Transformations'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html',1,'Geometric Image Transformations'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html',1,'Miscellaneous Image Transformations'],['https://docs.opencv.org/4.2.0/d3/dbe/tutorial_opening_closing_hats.html',1,'More Morphology Transformations'],['https://docs.opencv.org/4.2.0/d9/d61/tutorial_py_morphological_ops.html',1,'Morphological Transformations'],['https://docs.opencv.org/4.2.0/d4/d76/tutorial_js_morphological_ops.html',1,'Morphological Transformations']]], - ['transformations_518',['Space transformations',['https://eigen.tuxfamily.org/dox/group__TutorialGeometry.html',1,'']]], - ['transformations_519',['Transformations',['https://docs.opencv.org/4.2.0/d7/d72/tutorial_transformations.html',1,'']]], - ['transformations_20of_20images_520',['Transformations of Images',['https://docs.opencv.org/4.2.0/da/d6e/tutorial_py_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dd/d52/tutorial_js_geometric_transformations.html',1,'Geometric Transformations of Images']]], - ['transformations_2emarkdown_521',['transformations.markdown',['https://docs.opencv.org/4.2.0/d9/d7a/transformations_8markdown.html',1,'']]], - ['transformed_522',['transformed',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#abe249d52c411b1c9a6771d4ee379b9bf',1,'Eigen::AlignedBox']]], - ['transformfd_523',['transformFD',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#ga95f303288dac0e02ab3777b603933921',1,'cv::ximgproc::transformFD()'],['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#ga95f303288dac0e02ab3777b603933921',1,'transformFD()(Global Namespace)']]], - ['transformmat_524',['transformMat',['https://docs.opencv.org/4.2.0/d7/d56/structcv_1_1datasets_1_1SLAM__tumindoorObj.html#a22515179dba2339f274c41130e790870',1,'cv::datasets::SLAM_tumindoorObj']]], - ['transformpcpose_525',['transformPCPose',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab21c92ff881ae85b72c552e7e6e52c55',1,'cv::ppf_match_3d::transformPCPose()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab21c92ff881ae85b72c552e7e6e52c55',1,'transformPCPose()(Global Namespace)']]], - ['transformpoints_526',['transformPoints',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gab6ea2bd4162efd48f2b027d21d0b7f56',1,'cv::cuda::transformPoints()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gab6ea2bd4162efd48f2b027d21d0b7f56',1,'transformPoints()(Global Namespace)']]], - ['transformptr_527',['transformPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fa9448a29af2c0d25ecbeec292957a',1,'cv::cudev::transformPtr(const SrcPtr &src, const Op &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be7d3b72b752cf6d55f6c0b1d8e3a37',1,'cv::cudev::transformPtr(const Src1Ptr &src1, const Src2Ptr &src2, const Op &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fa9448a29af2c0d25ecbeec292957a',1,'transformPtr(const SrcPtr &src, const Op &op)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be7d3b72b752cf6d55f6c0b1d8e3a37',1,'transformPtr(const Src1Ptr &src1, const Src2Ptr &src2, const Op &op)(Global Namespace)']]], - ['transformreadings_528',['transformReadings',['../namespaceutil.html#aae9ae4acf4ddb63d9633bb398b0616ee',1,'util']]], - ['transforms_20in_20opencv_529',['Image Transforms in OpenCV',['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'']]], - ['transforms_20in_20opencv_20js_530',['Image Transforms in OpenCV.js',['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'']]], - ['transformtag_531',['TransformTag',['https://docs.opencv.org/4.2.0/d8/d13/structcv_1_1detail_1_1TransformTag.html',1,'cv::detail']]], - ['transformtimediagonalreturntype_532',['TransformTimeDiagonalReturnType',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a51af5e8d8d9d9bfec091ff8aa5b7845a',1,'Eigen::Transform']]], - ['transformtraits_533',['TransformTraits',['https://eigen.tuxfamily.org/dox/group__enums.html#gaee59a86102f150923b0cac6d4ff05107',1,'Eigen::TransformTraits'],['https://eigen.tuxfamily.org/dox/group__enums.html#gaee59a86102f150923b0cac6d4ff05107',1,'TransformTraits(Global Namespace)']]], - ['transformtraj_534',['transformTraj',['../namespaceutil.html#a56fdb65ab2da6e0935db38a4a7a403fa',1,'util']]], - ['transformtype_535',['transformType',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#ab162fed327f7753dbb439d480e493a64',1,'cv::rgbd::ICPOdometry::transformType'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a515c03a41ab16c1c2d18c587bfef91e8',1,'cv::rgbd::RgbdICPOdometry::transformType'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a7a5ca2ab4842ad8165dc232f7bba6743',1,'cv::rgbd::RgbdOdometry::transformType']]], - ['transformtypes_536',['TransformTypes',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac867e23ce513e1b12612a5a34a97b264',1,'cv::xphoto::TransformTypes'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac867e23ce513e1b12612a5a34a97b264',1,'TransformTypes(Global Namespace)']]], - ['transhelper_537',['TransHelper',['https://docs.opencv.org/4.2.0/d7/df5/structcv_1_1detail_1_1TransHelper.html',1,'cv::detail']]], - ['transhelper_3c_20k_2c_20std_3a_3atuple_3c_20args_2e_2e_2e_20_3e_2c_20r_20_3e_538',['TransHelper< K, std::tuple< Args... >, R >',['https://docs.opencv.org/4.2.0/d7/df5/structcv_1_1detail_1_1TransHelper.html',1,'']]], - ['transhelper_3c_20k_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20out_20_3e_539',['TransHelper< K, std::tuple< Ins... >, Out >',['https://docs.opencv.org/4.2.0/d5/dd6/structcv_1_1detail_1_1TransHelper_3_01K_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01Out_01_4.html',1,'cv::detail']]], - ['transientareassegmentationmodule_540',['TransientAreasSegmentationModule',['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html',1,'cv::bioinspired']]], - ['transientareassegmentationmodule_2ehpp_541',['transientareassegmentationmodule.hpp',['https://docs.opencv.org/4.2.0/d4/d4c/transientareassegmentationmodule_8hpp.html',1,'']]], - ['transition_20guide_542',['Transition guide',['https://docs.opencv.org/4.2.0/db/dfa/tutorial_transition_guide.html',1,'']]], - ['transition_5fguide_2emarkdown_543',['transition_guide.markdown',['https://docs.opencv.org/4.2.0/dd/d70/transition__guide_8markdown.html',1,'']]], - ['transition_5fp_544',['transition_p',['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a00092fab778d395ac88830ece8639485',1,'cv::text::OCRBeamSearchDecoder::transition_p'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a7f63c03387913d6c872e3c4b55007a27',1,'cv::text::OCRHMMDecoder::transition_p']]], - ['transitionmatrix_545',['transitionMatrix',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a0657173e411acbf40d2d3c6b46e03b19',1,'cv::KalmanFilter']]], - ['translate_546',['translate',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a11d9cdc588a9c08c0c1c205a872663fd',1,'cv::Affine3::translate()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a11d9cdc588a9c08c0c1c205a872663fd',1,'Affine3< float >::translate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a001a4c2c5d9b06d4cc7e9a83310255c4',1,'regex_traits< _CharType >::translate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a001a4c2c5d9b06d4cc7e9a83310255c4',1,'std::regex_traits::translate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a319e3e6338893db6986533d545a92046',1,'Eigen::AlignedBox::translate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aa28c8ebe8367243653e8fb151670b24b',1,'Eigen::Transform::translate()']]], - ['translate_5fnocase_547',['translate_nocase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#aa92edaaafe63f2333dc9d1ce9167c0f3',1,'regex_traits< _CharType >::translate_nocase()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#aa92edaaafe63f2333dc9d1ce9167c0f3',1,'std::regex_traits::translate_nocase()']]], - ['translated_548',['translated',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a3d7dad56b2c9b6e3dc360c078c639f47',1,'Eigen::AlignedBox']]], - ['translation_549',['Translation',['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html',1,'Eigen']]], - ['translation_550',['TRANSLATION',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a25c82843207af8c3e2a133dc5c887f8dac2ff112f8f88bc6d52804e7381ac48c4',1,'cv::rgbd::Odometry']]], - ['translation_551',['translation',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#af0df7115f87f425839a7a3f2e4e1ed17',1,'cv::Affine3::translation(const Vec3 &t)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a19e2decf4df4a6e72118f9ef6482d502',1,'cv::Affine3::translation() const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#af0df7115f87f425839a7a3f2e4e1ed17',1,'Affine3< float >::translation(const Vec3 &t)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a19e2decf4df4a6e72118f9ef6482d502',1,'Affine3< float >::translation() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aa3e4201cc8d1fd98136af66544148dc7',1,'Eigen::Transform::translation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#adf4c6d97bd3f10edfa95bb04331ec8ed',1,'Eigen::Transform::translation() const']]], - ['translation_552',['Translation',['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a7e74484699e17444c6d660c17117bf7b',1,'Eigen::Translation::Translation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a3048c4c2cf095548454aef051af5a036',1,'Eigen::Translation::Translation(const Translation< OtherScalarType, Dim > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#aef1fd431ac3f2197a8e33ce6d4163061',1,'Eigen::Translation::Translation(const VectorType &vector)']]], - ['translationbasedlocaloutlierrejector_553',['TranslationBasedLocalOutlierRejector',['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html',1,'cv::videostab::TranslationBasedLocalOutlierRejector'],['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a52028c031cc736c093fa42975fad4884',1,'cv::videostab::TranslationBasedLocalOutlierRejector::TranslationBasedLocalOutlierRejector()']]], - ['translationpart_554',['TranslationPart',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aabeaa2d375bf1b6b1d5cb5d1904fbd06',1,'Eigen::Transform']]], - ['translationtype_555',['TranslationType',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a6b463d14d8be4c0eda2eed6e943b831f',1,'Eigen::Transform']]], - ['transpccoeff_556',['transPCCoeff',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab6d5a91876b73a024830da8405909b79',1,'cv::ppf_match_3d::transPCCoeff()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab6d5a91876b73a024830da8405909b79',1,'transPCCoeff()(Global Namespace)']]], - ['transpose_557',['Transpose',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpose.html',1,'Eigen']]], - ['transpose_558',['transpose',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ad6293cc8922e39419ca4a91e9343f51b',1,'cv::MatOp::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'Eigen::DenseBase::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'DenseBase< ArrayWrapper< ExpressionType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'DenseBase< Solve< Decomposition, RhsType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ae0959abb2cfa16c9df2e5782e721811c',1,'Eigen::HouseholderSequence::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html#ab40e9cdc4582593511e57ee896e055a2',1,'Eigen::JacobiRotation::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'Eigen::PermutationBase::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< PermutationWrapper< _IndicesType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad779637ca3e3aeff2d35e1806e59f7d9',1,'Eigen::SelfAdjointView::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a33950671584ae306fbdc1c23f010be88',1,'Eigen::SelfAdjointView::transpose() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad779637ca3e3aeff2d35e1806e59f7d9',1,'SelfAdjointView< const Derived, UpLo >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a33950671584ae306fbdc1c23f010be88',1,'SelfAdjointView< const Derived, UpLo >::transpose() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'Eigen::SolverBase::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< FullPivLU< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< HouseholderQR< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< LLT< _MatrixType, _UpLo > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< PartialPivLU< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< SVDBase< Derived > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a4ecc54d938d8d0049cb821e92c6a7d60',1,'Eigen::SparseLU::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ac9efe6f446781eb1eb6e62d4a7707fd4',1,'Eigen::TriangularView::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#aa45efa0f1d6f8c009b75a4f6fc00e063',1,'Eigen::TriangularView::transpose() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ac9efe6f446781eb1eb6e62d4a7707fd4',1,'TriangularView< const Derived, Mode >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#aa45efa0f1d6f8c009b75a4f6fc00e063',1,'TriangularView< const Derived, Mode >::transpose() const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga46630ed6c0ea6254a35f447289bd7404',1,'cv::transpose()'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga327b71c3cb811a904ccf5fba37fc29f2',1,'cv::cuda::transpose()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga46630ed6c0ea6254a35f447289bd7404',1,'transpose(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga327b71c3cb811a904ccf5fba37fc29f2',1,'transpose(InputArray src1, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['transpose_2ehpp_559',['transpose.hpp',['https://docs.opencv.org/4.2.0/d3/dfa/transpose_8hpp.html',1,'']]], - ['transpose_5f_560',['transpose_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab945e9df9fdb4ad2e224d1caa8bad265',1,'cv::cudev::transpose_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab945e9df9fdb4ad2e224d1caa8bad265',1,'transpose_()(Global Namespace)']]], - ['transposebody_561',['TransposeBody',['https://docs.opencv.org/4.2.0/d2/d40/structcv_1_1cudev_1_1TransposeBody.html',1,'cv::cudev']]], - ['transposeinplace_562',['transposeInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'Eigen::DenseBase::transposeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'DenseBase< ArrayWrapper< ExpressionType > >::transposeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::transposeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'DenseBase< Solve< Decomposition, RhsType > >::transposeInPlace()']]], - ['transpositions_563',['Transpositions',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html',1,'Eigen::Transpositions< SizeAtCompileTime, MaxSizeAtCompileTime, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a415e07d885093f3f256394f59d4986f4',1,'Eigen::Transpositions::Transpositions(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#aae3eb58072f5b26f3851925eec5a006f',1,'Eigen::Transpositions::Transpositions(const TranspositionsBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a6a02dae883f9bc072de3268e1696d0ba',1,'Eigen::Transpositions::Transpositions(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a415e07d885093f3f256394f59d4986f4',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::Transpositions(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#aae3eb58072f5b26f3851925eec5a006f',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::Transpositions(const TranspositionsBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a6a02dae883f9bc072de3268e1696d0ba',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::Transpositions(Index size)']]], - ['transpositions_3c_20rowsatcompiletime_2c_20maxrowsatcompiletime_20_3e_564',['Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html',1,'']]], - ['transpositionsp_565',['transpositionsP',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a47257d3500f9f7c9a4478158d0e34941',1,'Eigen::LDLT']]], - ['transpositionsstorage_566',['TranspositionsStorage',['https://eigen.tuxfamily.org/dox/structEigen_1_1TranspositionsStorage.html',1,'Eigen']]], - ['transversemercatorprojector_567',['TransverseMercatorProjector',['https://docs.opencv.org/4.2.0/d5/df7/structcv_1_1detail_1_1TransverseMercatorProjector.html',1,'cv::detail']]], - ['transversemercatorwarper_568',['TransverseMercatorWarper',['https://docs.opencv.org/4.2.0/d4/d6b/classcv_1_1detail_1_1TransverseMercatorWarper.html',1,'cv::detail::TransverseMercatorWarper'],['https://docs.opencv.org/4.2.0/df/d33/classcv_1_1TransverseMercatorWarper.html',1,'cv::TransverseMercatorWarper'],['https://docs.opencv.org/4.2.0/d4/d6b/classcv_1_1detail_1_1TransverseMercatorWarper.html#a15da1369124f1c12a32e14edd68a897a',1,'cv::detail::TransverseMercatorWarper::TransverseMercatorWarper()']]], - ['trapezoidalvelocityprofile_569',['TrapezoidalVelocityProfile',['../classcontrol_1_1TrapezoidalVelocityProfile.html',1,'control::TrapezoidalVelocityProfile< dim >'],['../classcontrol_1_1TrapezoidalVelocityProfile.html#a1957617258addd8a7a71d86801cc893e',1,'control::TrapezoidalVelocityProfile::TrapezoidalVelocityProfile()']]], - ['trapezoidalvelocityprofile_3c_201_20_3e_570',['TrapezoidalVelocityProfile< 1 >',['../classcontrol_1_1TrapezoidalVelocityProfile.html',1,'control']]], - ['trapezoidalvelocityprofile_3c_20outputdim_20_3e_571',['TrapezoidalVelocityProfile< outputDim >',['../classcontrol_1_1TrapezoidalVelocityProfile.html',1,'control']]], - ['traps_572',['traps',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#aada3546b2e0b32ecaef18c00e2b0dcfd',1,'std::__numeric_limits_base::traps'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#aada3546b2e0b32ecaef18c00e2b0dcfd',1,'std::numeric_limits::traps']]], - ['treat_5fas_5ffloating_5fpoint_573',['treat_as_floating_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01895.html',1,'std::chrono']]], - ['tree_574',['tree',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html',1,'__gnu_pbds::tree< class, class, class, class, Node_Update, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#a5c900b3230feb9f5c59bf80995eaa2b1',1,'__gnu_pbds::tree::tree(const cmp_fn &c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#a9d2c8a45cf06ac2da54bef2ff3514468',1,'__gnu_pbds::tree::tree(It first, It last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#a75e6c7ff0c466d02e91bfe5243684109',1,'__gnu_pbds::tree::tree(It first, It last, const cmp_fn &c)']]], - ['tree_5fdepth_575',['tree_depth',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a674576adc7d5244cf93ae8d1f3aba85e',1,'cv::face::FacemarkKazemi::Params::tree_depth'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a2b2a0c3cb03dd05aaa29bd6994f8ee87',1,'cv::face::FacemarkLBF::Params::tree_depth']]], - ['tree_5fmetadata_5fhelper_576',['tree_metadata_helper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12043.html',1,'__gnu_pbds::detail']]], - ['tree_5fmetadata_5fhelper_3c_20node_5fupdate_2c_20false_20_3e_577',['tree_metadata_helper< Node_Update, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12047.html',1,'__gnu_pbds::detail']]], - ['tree_5fmetadata_5fhelper_3c_20node_5fupdate_2c_20true_20_3e_578',['tree_metadata_helper< Node_Update, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12051.html',1,'__gnu_pbds::detail']]], - ['tree_5fn_579',['tree_n',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a2369f572aaed3f61a175b29f03f42563',1,'cv::face::FacemarkLBF::Params']]], - ['tree_5fnode_5fmetadata_5fdispatch_580',['tree_node_metadata_dispatch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12055.html',1,'__gnu_pbds::detail']]], - ['tree_5forder_5fstatistics_5fnode_5fupdate_581',['tree_order_statistics_node_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html',1,'__gnu_pbds']]], - ['tree_5fpolicy_2ehpp_582',['tree_policy.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01133.html',1,'']]], - ['tree_5fpolicy_2fnode_5fmetadata_5fselector_2ehpp_583',['tree_policy/node_metadata_selector.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17114.html',1,'']]], - ['tree_5fpolicy_2forder_5fstatistics_5fimp_2ehpp_584',['tree_policy/order_statistics_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17129.html',1,'']]], - ['tree_5ftag_585',['tree_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11239.html',1,'__gnu_pbds']]], - ['tree_5ftrace_5fbase_2ehpp_586',['tree_trace_base.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01154.html',1,'']]], - ['tree_5ftraits_587',['tree_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11663.html',1,'__gnu_pbds::detail']]], - ['tree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20ov_5ftree_5ftag_2c_20_5falloc_20_3e_588',['tree_traits< Key, Mapped, Cmp_Fn, Node_Update, ov_tree_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11879.html',1,'__gnu_pbds::detail']]], - ['tree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20rb_5ftree_5ftag_2c_20_5falloc_20_3e_589',['tree_traits< Key, Mapped, Cmp_Fn, Node_Update, rb_tree_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11979.html',1,'__gnu_pbds::detail']]], - ['tree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20splay_5ftree_5ftag_2c_20_5falloc_20_3e_590',['tree_traits< Key, Mapped, Cmp_Fn, Node_Update, splay_tree_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12031.html',1,'__gnu_pbds::detail']]], - ['tree_5ftraits_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20ov_5ftree_5ftag_2c_20_5falloc_20_3e_591',['tree_traits< Key, null_type, Cmp_Fn, Node_Update, ov_tree_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11883.html',1,'__gnu_pbds::detail']]], - ['tree_5ftraits_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20rb_5ftree_5ftag_2c_20_5falloc_20_3e_592',['tree_traits< Key, null_type, Cmp_Fn, Node_Update, rb_tree_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11983.html',1,'__gnu_pbds::detail']]], - ['tree_5ftraits_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20splay_5ftree_5ftag_2c_20_5falloc_20_3e_593',['tree_traits< Key, null_type, Cmp_Fn, Node_Update, splay_tree_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12035.html',1,'__gnu_pbds::detail']]], - ['trg_5fid_594',['trg_id',['https://docs.opencv.org/4.2.0/de/d39/structcv_1_1gapi_1_1plaidml_1_1config.html#a7be03e252b22c2ac83a03bac8c7f1dd4',1,'cv::gapi::plaidml::config']]], - ['triangle_595',['triangle',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a26c349619f95531945f6c0c7a24dedea',1,'cv::datasets::triangle'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a26c349619f95531945f6c0c7a24dedea',1,'triangle(Global Namespace)']]], - ['triangle_5ffan_596',['TRIANGLE_FAN',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba1778386fd1796017cf36965339b27cf7',1,'cv::ogl::TRIANGLE_FAN'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba1778386fd1796017cf36965339b27cf7',1,'TRIANGLE_FAN(Global Namespace)']]], - ['triangle_5fstrip_597',['TRIANGLE_STRIP',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabae656afaa0987fa2f044e3fdc260aa140',1,'cv::ogl::TRIANGLE_STRIP'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabae656afaa0987fa2f044e3fdc260aa140',1,'TRIANGLE_STRIP(Global Namespace)']]], - ['triangles_598',['triangles',['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#a026fc525e61c2e0a72fc738ccc947601',1,'cv::face::FacemarkAAM::Model']]], - ['triangles_599',['TRIANGLES',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabab2fc9178ebe34e531f1451751e673c7d',1,'cv::ogl::TRIANGLES'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabab2fc9178ebe34e531f1451751e673c7d',1,'TRIANGLES(Global Namespace)']]], - ['triangularbase_600',['TriangularBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html',1,'Eigen']]], - ['triangularbase_3c_20selfadjointview_3c_20_5fmatrixtype_2c_20uplo_20_3e_20_3e_601',['TriangularBase< SelfAdjointView< _MatrixType, UpLo > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html',1,'']]], - ['triangularbase_3c_20selfadjointview_3c_20const_20derived_2c_20uplo_20_3e_20_3e_602',['TriangularBase< SelfAdjointView< const Derived, UpLo > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html',1,'']]], - ['triangularbase_3c_20triangularview_3c_20_5fmatrixtype_2c_20_5fmode_20_3e_20_3e_603',['TriangularBase< TriangularView< _MatrixType, _Mode > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html',1,'']]], - ['triangularview_604',['TriangularView',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html',1,'Eigen']]], - ['triangularview_605',['triangularView',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#aacba330c3a12d1cac75c2f9df8c0f347',1,'Eigen::SelfAdjointView::triangularView'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#aacba330c3a12d1cac75c2f9df8c0f347',1,'SelfAdjointView< const Derived, UpLo >::triangularView'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a56665aa894f49f2765291fee0eaeb9c6',1,'Eigen::MatrixBase::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aa044521145e74117ad1df42460d7b520',1,'Eigen::MatrixBase::triangularView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a56665aa894f49f2765291fee0eaeb9c6',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aa044521145e74117ad1df42460d7b520',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::triangularView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a56665aa894f49f2765291fee0eaeb9c6',1,'MatrixBase< Solve< Decomposition, RhsType > >::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aa044521145e74117ad1df42460d7b520',1,'MatrixBase< Solve< Decomposition, RhsType > >::triangularView() const']]], - ['triangularview_3c_20const_20derived_2c_20mode_20_3e_606',['TriangularView< const Derived, Mode >',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html',1,'']]], - ['triangularviewimpl_3c_20_5fmatrixtype_2c_20_5fmode_2c_20dense_20_3e_607',['TriangularViewImpl< _MatrixType, _Mode, Dense >',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html',1,'Eigen']]], - ['triangularviewimpl_3c_20matrixtype_2c_20mode_2c_20sparse_20_3e_608',['TriangularViewImpl< MatrixType, Mode, Sparse >',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01MatrixType_00_01Mode_00_01Sparse_01_4.html',1,'Eigen']]], - ['triangulatepoints_609',['triangulatePoints',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad3fc9a0c82b08df034234979960b778c',1,'cv::triangulatePoints()'],['https://docs.opencv.org/4.2.0/d0/dbd/group__triangulation.html#ga211c855276b3084f3bbd8b2d9161dc74',1,'cv::sfm::triangulatePoints()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad3fc9a0c82b08df034234979960b778c',1,'triangulatePoints(InputArray projMatr1, InputArray projMatr2, InputArray projPoints1, InputArray projPoints2, OutputArray points4D)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/dbd/group__triangulation.html#ga211c855276b3084f3bbd8b2d9161dc74',1,'triangulatePoints(InputArrayOfArrays points2d, InputArrayOfArrays projection_matrices, OutputArray points3d)(Global Namespace)']]], - ['triangulation_610',['Triangulation',['https://docs.opencv.org/4.2.0/d0/dbd/group__triangulation.html',1,'']]], - ['triangulation_2ehpp_611',['triangulation.hpp',['https://docs.opencv.org/4.2.0/da/de8/triangulation_8hpp.html',1,'']]], - ['tridiagonalization_612',['Tridiagonalization',['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html',1,'Eigen::Tridiagonalization< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a05406b7df9a92fdcba72d31443f67a98',1,'Eigen::Tridiagonalization::Tridiagonalization(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a9ea2e6154bf35494ee68e037f0867cbd',1,'Eigen::Tridiagonalization::Tridiagonalization(Index size=Size==Dynamic ? 2 :Size)']]], - ['trie_613',['trie',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html',1,'__gnu_pbds::trie< class, class, class, class, Node_Update, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html#a5feddcc5a253f6fc4ff4567ad0359b6d',1,'__gnu_pbds::trie::trie(const access_traits &t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html#a0aaac7de1516a27993552064782cdec2',1,'__gnu_pbds::trie::trie(It first, It last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html#a0f9b513af82c2a51ba44849a2155096d',1,'__gnu_pbds::trie::trie(It first, It last, const access_traits &t)']]], - ['trie_5fmetadata_5fhelper_614',['trie_metadata_helper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12063.html',1,'__gnu_pbds::detail']]], - ['trie_5fmetadata_5fhelper_3c_20node_5fupdate_2c_20false_20_3e_615',['trie_metadata_helper< Node_Update, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12067.html',1,'__gnu_pbds::detail']]], - ['trie_5fmetadata_5fhelper_3c_20node_5fupdate_2c_20true_20_3e_616',['trie_metadata_helper< Node_Update, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12071.html',1,'__gnu_pbds::detail']]], - ['trie_5fnode_5fmetadata_5fdispatch_617',['trie_node_metadata_dispatch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12075.html',1,'__gnu_pbds::detail']]], - ['trie_5forder_5fstatistics_5fnode_5fupdate_618',['trie_order_statistics_node_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html',1,'__gnu_pbds']]], - ['trie_5fpolicy_2ehpp_619',['trie_policy.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01136.html',1,'']]], - ['trie_5fpolicy_2fnode_5fmetadata_5fselector_2ehpp_620',['trie_policy/node_metadata_selector.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17117.html',1,'']]], - ['trie_5fpolicy_2forder_5fstatistics_5fimp_2ehpp_621',['trie_policy/order_statistics_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17132.html',1,'']]], - ['trie_5fpolicy_5fbase_622',['trie_policy_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12087.html',1,'__gnu_pbds::detail']]], - ['trie_5fpolicy_5fbase_2ehpp_623',['trie_policy_base.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01454.html',1,'']]], - ['trie_5fprefix_5fsearch_5fnode_5fupdate_624',['trie_prefix_search_node_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html',1,'__gnu_pbds']]], - ['trie_5fstring_5faccess_5ftraits_625',['trie_string_access_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11363.html',1,'__gnu_pbds']]], - ['trie_5fstring_5faccess_5ftraits_5fimp_2ehpp_626',['trie_string_access_traits_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01457.html',1,'']]], - ['trie_5ftag_627',['trie_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11255.html',1,'__gnu_pbds']]], - ['trie_5ftraits_628',['trie_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11667.html',1,'__gnu_pbds::detail']]], - ['trie_5ftraits_3c_20key_2c_20mapped_2c_20_5fatraits_2c_20node_5fupdate_2c_20pat_5ftrie_5ftag_2c_20_5falloc_20_3e_629',['trie_traits< Key, Mapped, _ATraits, Node_Update, pat_trie_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11959.html',1,'__gnu_pbds::detail']]], - ['trie_5ftraits_3c_20key_2c_20null_5ftype_2c_20_5fatraits_2c_20node_5fupdate_2c_20pat_5ftrie_5ftag_2c_20_5falloc_20_3e_630',['trie_traits< Key, null_type, _ATraits, Node_Update, pat_trie_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11963.html',1,'__gnu_pbds::detail']]], - ['trimratio_631',['trimRatio',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#ab78d50ac661348fce0fd26c247bb85c6',1,'cv::videostab::LpMotionStabilizer::trimRatio()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#afc3dbde54f82fac976999469e049a3db',1,'cv::videostab::StabilizerBase::trimRatio() const']]], - ['trimratio_5f_632',['trimRatio_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#acd5ad58425a94dd6af0a29b98ee5517c',1,'cv::videostab::StabilizerBase']]], - ['triplet_633',['Triplet',['https://eigen.tuxfamily.org/dox/classEigen_1_1Triplet.html',1,'Eigen']]], - ['trivial_5fiterator_5fdifference_5ftype_634',['trivial_iterator_difference_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01537.html#ga3a45dab56a44f762c97eb0eaee17f6f2',1,'__gnu_pbds::trivial_iterator_difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01537.html#ga3a45dab56a44f762c97eb0eaee17f6f2',1,'trivial_iterator_difference_type(Global Namespace)']]], - ['trivial_5fiterator_5ftag_635',['trivial_iterator_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11191.html',1,'__gnu_pbds']]], - ['true_5ftype_636',['true_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga6a860513044e23d34e553ea986e83fa1',1,'std::true_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga6a860513044e23d34e553ea986e83fa1',1,'true_type(Global Namespace)']]], - ['truename_637',['truename',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a226b1f5216eec8172bf4b71bede27a74',1,'std::numpunct::truename()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a226b1f5216eec8172bf4b71bede27a74',1,'std::numpunct_byname::truename()']]], - ['trunc_638',['trunc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_ios< char, _Traits >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_iostream< char >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_istream< char >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_istream< char, _Traits >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_ostream< char >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_ostream< char, _Traits >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_fstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ifstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ios::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_iostream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_istream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_istringstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ofstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ostream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ostringstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_stringstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::ios_base::trunc']]], - ['truncated_639',['truncated',['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#a19f8baa131256e8532657f6a3265d5bb',1,'cv::datasets::PascalObj']]], - ['truncatethreshold_640',['truncateThreshold',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a7a4ff0e74b36ecb1e4be57ff1865ae56',1,'cv::dynafu::Params::truncateThreshold'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#ae813e8429d58751cf4deb56ae7362ee4',1,'cv::kinfu::Params::truncateThreshold']]], - ['try_5flock_641',['try_lock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab431f6ac9476a921df98db8862be201a',1,'std']]], - ['try_5fpull_642',['try_pull',['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#af4a40c09634ba45686b2177f38c49022',1,'cv::GStreamingCompiled']]], - ['try_5fto_5flock_643',['try_to_lock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga05e641e1ecba98edb6fa4714a6c03e0d',1,'std::try_to_lock'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga05e641e1ecba98edb6fa4714a6c03e0d',1,'try_to_lock(Global Namespace)']]], - ['try_5fto_5flock_5ft_644',['try_to_lock_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07199.html',1,'std']]], - ['tryattach_645',['tryAttach',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#afd329d7dfd4e38239bef14ecee9977cb',1,'cv::dnn::Layer']]], - ['tryfuse_646',['tryFuse',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#ae52d400e21d50885742aed859ce732ba',1,'cv::dnn::Layer']]], - ['tryinitcontroller_647',['tryInitController',['../classcontrol_1_1PlanarArmController.html#a70e57f603057bcf79cf4524315be38c0',1,'control::PlanarArmController']]], - ['ts_648',['Filesystem TS',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html',1,'']]], - ['tsdf_5fmax_5fweight_649',['tsdf_max_weight',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a74d018302877a5d279f203982219c4a7',1,'cv::dynafu::Params::tsdf_max_weight'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a9753dcad7d91c98985b606cf4b5a90b1',1,'cv::kinfu::Params::tsdf_max_weight']]], - ['tsdf_5fmin_5fcamera_5fmovement_650',['tsdf_min_camera_movement',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a8dea18215b11c8c469951f86bcb9fe48',1,'cv::dynafu::Params::tsdf_min_camera_movement'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a07a71c122207f4ecf95f42a83d6dbc48',1,'cv::kinfu::Params::tsdf_min_camera_movement']]], - ['tsdf_5ftrunc_5fdist_651',['tsdf_trunc_dist',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#abdfef009310c1cab3935e3210b6fc87f',1,'cv::dynafu::Params::tsdf_trunc_dist'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a16ea51cf7e543a0be9dfd7d320303627',1,'cv::kinfu::Params::tsdf_trunc_dist']]], - ['tt_20clang_20format_20tt_652',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], - ['tuple_653',['tuple',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'std::tuple< _Elements >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00161.html',1,'(Global Namespace)']]], - ['tuple_2ehpp_654',['tuple.hpp',['https://docs.opencv.org/4.2.0/d3/d6f/tuple_8hpp.html',1,'']]], - ['tuple_3c_20_5fbound_5fargs_2e_2e_2e_20_3e_655',['tuple< _Bound_args... >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], - ['tuple_3c_20_5fforwarditerator1_2c_20_5fforwarditerator1_2c_20_5fbinarypredicate_20_3e_656',['tuple< _ForwardIterator1, _ForwardIterator1, _BinaryPredicate >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], - ['tuple_3c_20_5ft1_2c_20_5ft2_20_3e_657',['tuple< _T1, _T2 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02947.html',1,'std']]], - ['tuple_3c_20pointer_2c_20_5fdp_20_3e_658',['tuple< pointer, _Dp >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], - ['tuple_3c_20pointer_2c_20default_5fdelete_3c_20_5fcodecvt_20_3e_20_3e_659',['tuple< pointer, default_delete< _Codecvt > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], - ['tuple_3c_20pointer_2c_20default_5fdelete_3c_20_5fres_5ftype_20_3e_20_3e_660',['tuple< pointer, default_delete< _Res_type > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], - ['tuple_3c_20pointer_2c_20default_5fdelete_3c_20_5fresult_3c_20_5fres_20_3e_20_3e_20_3e_661',['tuple< pointer, default_delete< _Result< _Res > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], - ['tuple_3c_20pointer_2c_20default_5fdelete_3c_20_5fresult_5fbase_20_3e_20_3e_662',['tuple< pointer, default_delete< _Result_base > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], - ['tuple_3c_20pointer_2c_20default_5fdelete_3c_20bool_20_3e_20_3e_663',['tuple< pointer, default_delete< bool > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], - ['tuple_3c_20std_3a_3aarray_3c_20_5ftp_2c_20_5flen_20_3e_2c_20_5fpred_20_3e_664',['tuple< std::array< _Tp, _Len >, _Pred >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], - ['tuple_5fadapter_2ehpp_665',['tuple_adapter.hpp',['https://docs.opencv.org/4.2.0/de/dd7/tuple__adapter_8hpp.html',1,'']]], - ['tuple_5fcat_666',['tuple_cat',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga23a2e3e40fefd39ffe278df7ebbd52a0',1,'std::tuple_cat()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga23a2e3e40fefd39ffe278df7ebbd52a0',1,'tuple_cat()(Global Namespace)']]], - ['tuple_5felement_667',['tuple_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01715.html',1,'std']]], - ['tuple_5felement_3c_200_2c_20std_3a_3apair_3c_20_5ftp1_2c_20_5ftp2_20_3e_20_3e_668',['tuple_element< 0, std::pair< _Tp1, _Tp2 > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04579.html',1,'std']]], - ['tuple_5felement_3c_200_2c_20tuple_3c_20_5fhead_2c_20_5ftail_2e_2e_2e_20_3e_20_3e_669',['tuple_element< 0, tuple< _Head, _Tail... > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02959.html',1,'std']]], - ['tuple_5felement_3c_201_2c_20std_3a_3apair_3c_20_5ftp1_2c_20_5ftp2_20_3e_20_3e_670',['tuple_element< 1, std::pair< _Tp1, _Tp2 > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04583.html',1,'std']]], - ['tuple_5felement_3c_20_5f_5fi_20_2d_201_2c_20tuple_3c_20_5ftail_2e_2e_2e_20_3e_20_3e_671',['tuple_element< __i - 1, tuple< _Tail... > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01715.html',1,'']]], - ['tuple_5felement_3c_20_5f_5fi_2c_20tuple_3c_20_5fhead_2c_20_5ftail_2e_2e_2e_20_3e_20_3e_672',['tuple_element< __i, tuple< _Head, _Tail... > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02955.html',1,'std']]], - ['tuple_5felement_3c_20_5f_5fi_2c_20tuple_3c_3e_20_3e_673',['tuple_element< __i, tuple<> >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02963.html',1,'std']]], - ['tuple_5felement_3c_20_5fint_2c_20_3a_3aarray_3c_20_5ftp_2c_20_5fnm_20_3e_20_3e_674',['tuple_element< _Int, ::array< _Tp, _Nm > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01719.html',1,'std']]], - ['tuple_5felement_3c_20_5fint_2c_20std_3a_3a_5f_5fdebug_3a_3aarray_3c_20_5ftp_2c_20_5fnm_20_3e_20_3e_675',['tuple_element< _Int, std::__debug::array< _Tp, _Nm > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08823.html',1,'std']]], - ['tuple_5fsize_676',['tuple_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01707.html',1,'std']]], - ['tuple_5fsize_3c_20std_3a_3a_5f_5fdebug_3a_3aarray_3c_20_5ftp_2c_20_5fnm_20_3e_20_3e_677',['tuple_size< std::__debug::array< _Tp, _Nm > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08819.html',1,'std']]], - ['tuple_5fsize_3c_20std_3a_3apair_3c_20_5ftp1_2c_20_5ftp2_20_3e_20_3e_678',['tuple_size< std::pair< _Tp1, _Tp2 > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04575.html',1,'std']]], - ['tuple_5fsize_3c_20tuple_3c_20_5felements_2e_2e_2e_20_3e_20_3e_679',['tuple_size< tuple< _Elements... > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02951.html',1,'std']]], - ['tuple_5fsize_3c_3a_3aarray_3c_20_5ftp_2c_20_5fnm_20_3e_20_3e_680',['tuple_size<::array< _Tp, _Nm > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01711.html',1,'std']]], - ['tupletraits_681',['TupleTraits',['https://docs.opencv.org/4.2.0/dd/d08/structcv_1_1cudev_1_1TupleTraits.html',1,'cv::cudev']]], - ['tupletraits_3c_20tuple_3c_20p0_2c_20p1_2c_20p2_2c_20p3_2c_20p4_2c_20p5_2c_20p6_2c_20p7_2c_20p8_2c_20p9_20_3e_20_3e_682',['TupleTraits< tuple< P0, P1, P2, P3, P4, P5, P6, P7, P8, P9 > >',['https://docs.opencv.org/4.2.0/d2/dae/structcv_1_1cudev_1_1TupleTraits_3_01tuple_3_01P0_00_01P1_00_01P2_00_01P3_00_01P4_00_01P5_00_01P41642a2d25b95a5ddb87ca2004b28336.html',1,'cv::cudev']]], - ['turnaround_683',['turnaround',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a39055bc42fd5822e8a3a2c9639c3612a',1,'cv::datasets::turnaround'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a39055bc42fd5822e8a3a2c9639c3612a',1,'turnaround(Global Namespace)']]], - ['turquoise_684',['turquoise',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a6b3ce38104fa104c33c3ef353052a3ab',1,'cv::viz::Color']]], - ['tutorial_685',['tutorial',['https://docs.opencv.org/4.2.0/db/d56/tutorial_capture_graycode_pattern.html',1,'Capture Gray code pattern tutorial'],['https://docs.opencv.org/4.2.0/d0/de8/tutorial_capture_sinusoidal_pattern.html',1,'Capture Sinusoidal pattern tutorial'],['https://docs.opencv.org/4.2.0/dc/da9/tutorial_decode_graycode_pattern.html',1,'Decode Gray code pattern tutorial']]], - ['tutorial_686',['Line Features Tutorial',['https://docs.opencv.org/4.2.0/df/dfa/tutorial_line_descriptor_main.html',1,'']]], - ['tutorial_687',['Phase Unwrapping tutorial',['https://docs.opencv.org/4.2.0/db/d74/tutorial_unwrap_phase_map.html',1,'']]], - ['tutorial_20on_20facial_20landmark_20detector_20api_688',['Tutorial on Facial Landmark Detector API',['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'']]], - ['tutorial_2emarkdown_689',['tutorial.markdown',['https://docs.opencv.org/4.2.0/de/dee/tutorial_8markdown.html',1,'']]], - ['tutorial_5fcross_5freferencing_2emarkdown_690',['tutorial_cross_referencing.markdown',['https://docs.opencv.org/4.2.0/d2/d84/tutorial__cross__referencing_8markdown.html',1,'']]], - ['tutorial_5fcustomizing_5fcn_5ftracker_2emarkdown_691',['tutorial_customizing_cn_tracker.markdown',['https://docs.opencv.org/4.2.0/d0/dbd/tutorial__customizing__cn__tracker_8markdown.html',1,'']]], - ['tutorial_5fdecode_5fpattern_2emarkdown_692',['tutorial_decode_pattern.markdown',['https://docs.opencv.org/4.2.0/df/d46/tutorial__decode__pattern_8markdown.html',1,'']]], - ['tutorial_5fintroduction_5fto_5ftracker_2emarkdown_693',['tutorial_introduction_to_tracker.markdown',['https://docs.opencv.org/4.2.0/d9/d41/tutorial__introduction__to__tracker_8markdown.html',1,'']]], - ['tutorial_5fmultitracker_2emarkdown_694',['tutorial_multitracker.markdown',['https://docs.opencv.org/4.2.0/d2/dcc/tutorial__multitracker_8markdown.html',1,'']]], - ['tutorials_695',['Fuzzy image processing tutorials',['https://docs.opencv.org/4.2.0/d7/d36/tutorial_fuzzy.html',1,'']]], - ['tutorials_696',['Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'Introduction to OpenCV-Python Tutorials'],['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'Introduction to OpenCV.js and Tutorials'],['https://docs.opencv.org/4.2.0/d9/df8/tutorial_root.html',1,'OpenCV Tutorials'],['https://docs.opencv.org/4.2.0/d6/d00/tutorial_py_root.html',1,'OpenCV-Python Tutorials'],['https://docs.opencv.org/4.2.0/d5/d10/tutorial_js_root.html',1,'OpenCV.js Tutorials']]], - ['tutorials_697',['Structured Light tutorials',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_structured_light.html',1,'']]], - ['tutorials_20for_20bgsegm_20module_698',['Tutorials for bgsegm module',['https://docs.opencv.org/4.2.0/d3/d89/tutorial_table_of_content_bgsegm.html',1,'']]], - ['tutorials_20for_20contrib_20modules_699',['Tutorials for contrib modules',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_contrib_root.html',1,'']]], - ['tutorials_20for_20face_20module_700',['Tutorials for face module',['https://docs.opencv.org/4.2.0/de/d27/tutorial_table_of_content_face.html',1,'']]], - ['tutorials_2emarkdown_701',['tutorials.markdown',['https://docs.opencv.org/4.2.0/d7/d54/tutorials_8markdown.html',1,'']]], - ['tutorialsparse_5fexample_5fdetails_702',['TutorialSparse_example_details',['https://eigen.tuxfamily.org/dox/TutorialSparse_example_details.html',1,'']]], - ['twistedby_703',['twistedBy',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'Eigen::SparseMatrixBase::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< Transpose< MatrixType > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#acde15b45cf7b43520e1005ec65d55f3c',1,'Eigen::SparseSelfAdjointView::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#acde15b45cf7b43520e1005ec65d55f3c',1,'SparseSelfAdjointView< const Derived, UpLo >::twistedBy()']]], - ['two_20dimensional_20phase_20maps_704',['Unwrap two-dimensional phase maps',['https://docs.opencv.org/4.2.0/d9/dfb/tutorial_unwrap.html',1,'']]], - ['two_20images_20using_20opencv_705',['Adding (blending) two images using OpenCV',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_adding_images.html',1,'']]], - ['twopassstabilizer_706',['TwoPassStabilizer',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html',1,'cv::videostab::TwoPassStabilizer'],['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a6d8ba225fb09b05323886e9195f8589b',1,'cv::videostab::TwoPassStabilizer::TwoPassStabilizer()']]], - ['type_707',['Adding a new expression type',['https://eigen.tuxfamily.org/dox/TopicNewExpressionType.html',1,'']]], - ['type_708',['Data Structure Type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01539.html',1,'']]], - ['type_709',['type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11587.html',1,'__gnu_pbds::detail::entry_cmp< _VTp, Cmp_Fn, _Alloc, false >']]], - ['type_710',['Type',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39',1,'cv::viz::MouseEvent::Type'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57',1,'cv::TermCriteria::Type'],['https://docs.opencv.org/4.2.0/d0/d9e/structcv_1_1Accumulator.html#ad5bc00e84ea9780e0194fafdf2a95cbb',1,'cv::Accumulator::Type'],['https://docs.opencv.org/4.2.0/d3/d2d/structcv_1_1Accumulator_3_01char_01_4.html#a81b49efd978faaac393e11a4a93fbf26',1,'cv::Accumulator< char >::Type'],['https://docs.opencv.org/4.2.0/d8/dcf/structcv_1_1Accumulator_3_01short_01_4.html#a77fcd7bec156efe951d0204bbb389d13',1,'cv::Accumulator< short >::Type'],['https://docs.opencv.org/4.2.0/d6/d89/structcv_1_1Accumulator_3_01unsigned_01char_01_4.html#a56e36b86fad200b8ae19c219574a1ac2',1,'cv::Accumulator< unsigned char >::Type'],['https://docs.opencv.org/4.2.0/d9/d84/structcv_1_1Accumulator_3_01unsigned_01short_01_4.html#a81f22b96482f59175a9db504ddcbf281',1,'cv::Accumulator< unsigned short >::Type']]], - ['type_711',['type',['https://docs.opencv.org/4.2.0/d9/d6a/structcv_1_1cudev_1_1ConvertTuple.html#ac3700fd1fa65ba5c6a9ac74880f1084a',1,'cv::cudev::ConvertTuple::type'],['https://docs.opencv.org/4.2.0/dd/d3b/structcv_1_1detail_1_1flatten__g.html#a1bde1abb9b14be3539eee9e87205feba',1,'cv::detail::flatten_g::type'],['https://docs.opencv.org/4.2.0/df/de8/structcv_1_1detail_1_1flatten__g_3_01cv_1_1GMat_01_4.html#a76182a030c0c9939889096ee0d460792',1,'cv::detail::flatten_g< cv::GMat >::type'],['https://docs.opencv.org/4.2.0/d5/d97/structcv_1_1detail_1_1flatten__g_3_01cv_1_1GScalar_01_4.html#ab851de155fbb7845cbeafa2a19f5de03',1,'cv::detail::flatten_g< cv::GScalar >::type'],['https://docs.opencv.org/4.2.0/d8/d4e/structcv_1_1cudev_1_1functional__detail_1_1FloatType.html#a8f803719928d9f1dec322fc15085573d',1,'cv::cudev::functional_detail::FloatType::type'],['https://docs.opencv.org/4.2.0/d2/d54/structcv_1_1detail_1_1GTypeOf_3_01cv_1_1gapi_1_1own_1_1Mat_01_4.html#ac180264c4a42b1910184286ae6c97e93',1,'cv::detail::GTypeOf< cv::gapi::own::Mat >::type'],['https://docs.opencv.org/4.2.0/d6/d6f/structcv_1_1detail_1_1GTypeOf_3_01cv_1_1gapi_1_1own_1_1Scalar_01_4.html#a52f6341eb49810a18efcb815eb06e960',1,'cv::detail::GTypeOf< cv::gapi::own::Scalar >::type'],['https://docs.opencv.org/4.2.0/d0/d42/structcv_1_1detail_1_1GTypeOf_3_01cv_1_1gapi_1_1wip_1_1IStreamSource_1_1Ptr_01_4.html#a5aebb9bfa662eaaaea36ea494b779b94',1,'cv::detail::GTypeOf< cv::gapi::wip::IStreamSource::Ptr >::type'],['https://docs.opencv.org/4.2.0/d4/da4/structcv_1_1detail_1_1GTypeOf_3_01cv_1_1Mat_01_4.html#ada4d0d0a5311ace96a96ff4fa49ce76d',1,'cv::detail::GTypeOf< cv::Mat >::type'],['https://docs.opencv.org/4.2.0/de/d80/structcv_1_1detail_1_1GTypeOf_3_01cv_1_1Scalar_01_4.html#a836f56410d99a7a756116862c6d6a612',1,'cv::detail::GTypeOf< cv::Scalar >::type'],['https://docs.opencv.org/4.2.0/d6/d6a/structcv_1_1detail_1_1GTypeOf_3_01cv_1_1UMat_01_4.html#ab40940941d89769905586e316c96244c',1,'cv::detail::GTypeOf< cv::UMat >::type'],['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1GTypeOf_3_01std_1_1vector_3_01U_01_4_01_4.html#a60a7e94845175df8777a35d886b86627',1,'cv::detail::GTypeOf< std::vector< U > >::type'],['https://docs.opencv.org/4.2.0/d3/dc8/structcv_1_1detail_1_1has__custom__wrap.html#a93046c1542d94f9770df3420552e5085',1,'cv::detail::has_custom_wrap::type'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1cudev_1_1LargerType.html#a5faaef9dc50f0b9345d1ab87493a927d',1,'cv::cudev::LargerType::type'],['https://docs.opencv.org/4.2.0/d9/d0f/structcv_1_1cudev_1_1MakeVec_3_01bool_00_011_01_4.html#afa0c2544bc30b406aa412d9bc2bb16b4',1,'cv::cudev::MakeVec< bool, 1 >::type'],['https://docs.opencv.org/4.2.0/d1/d2c/structcv_1_1cudev_1_1MakeVec_3_01bool_00_012_01_4.html#acdb401965058d841a79c19899d2ff046',1,'cv::cudev::MakeVec< bool, 2 >::type'],['https://docs.opencv.org/4.2.0/dc/d8f/structcv_1_1cudev_1_1MakeVec_3_01bool_00_013_01_4.html#a3d173af25e6662635a8135df9434201d',1,'cv::cudev::MakeVec< bool, 3 >::type'],['https://docs.opencv.org/4.2.0/d2/d91/structcv_1_1cudev_1_1MakeVec_3_01bool_00_014_01_4.html#a64440622aa8006e7cb0bb0ed93aaee24',1,'cv::cudev::MakeVec< bool, 4 >::type'],['https://docs.opencv.org/4.2.0/d7/d64/structcv_1_1cudev_1_1MakeVec_3_01double_00_011_01_4.html#ae458072d3673d80c02e922eaf9d059a9',1,'cv::cudev::MakeVec< double, 1 >::type'],['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1MakeVec_3_01double_00_012_01_4.html#a4761407f978c6ad25a3c34dfa6bcc14b',1,'cv::cudev::MakeVec< double, 2 >::type'],['https://docs.opencv.org/4.2.0/d9/def/structcv_1_1cudev_1_1MakeVec_3_01double_00_013_01_4.html#a727211ee12e5a5b182b7c514138f8713',1,'cv::cudev::MakeVec< double, 3 >::type'],['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1MakeVec_3_01double_00_014_01_4.html#a293792b89b346b3c0663be77d01556a7',1,'cv::cudev::MakeVec< double, 4 >::type'],['https://docs.opencv.org/4.2.0/dd/d2b/structcv_1_1cudev_1_1MakeVec_3_01float_00_011_01_4.html#a7899bdfd8f324f2702ec18a4e273a22d',1,'cv::cudev::MakeVec< float, 1 >::type'],['https://docs.opencv.org/4.2.0/dc/de9/structcv_1_1cudev_1_1MakeVec_3_01float_00_012_01_4.html#af55247357ced93bbe76969c24e06d864',1,'cv::cudev::MakeVec< float, 2 >::type'],['https://docs.opencv.org/4.2.0/d8/d06/structcv_1_1cudev_1_1MakeVec_3_01float_00_013_01_4.html#a869aa8d1c71af84b1e3446368fbe08a3',1,'cv::cudev::MakeVec< float, 3 >::type'],['https://docs.opencv.org/4.2.0/da/d45/structcv_1_1cudev_1_1MakeVec_3_01float_00_014_01_4.html#a855d60b7fadd7ed1443332fd9c3525f3',1,'cv::cudev::MakeVec< float, 4 >::type'],['https://docs.opencv.org/4.2.0/db/d3a/structcv_1_1cudev_1_1MakeVec_3_01schar_00_011_01_4.html#ac7864980fab32efa4e33e5d60beab87b',1,'cv::cudev::MakeVec< schar, 1 >::type'],['https://docs.opencv.org/4.2.0/d4/d20/structcv_1_1cudev_1_1MakeVec_3_01schar_00_012_01_4.html#a24f2e7b793fdb3223f0dc70da8e96d04',1,'cv::cudev::MakeVec< schar, 2 >::type'],['https://docs.opencv.org/4.2.0/db/d3e/structcv_1_1cudev_1_1MakeVec_3_01schar_00_013_01_4.html#a7f8c6c5729c43f3c145fab5c3625c1a4',1,'cv::cudev::MakeVec< schar, 3 >::type'],['https://docs.opencv.org/4.2.0/d0/de6/structcv_1_1cudev_1_1MakeVec_3_01schar_00_014_01_4.html#a6ebcebe0bfd9f00029b9f60310942778',1,'cv::cudev::MakeVec< schar, 4 >::type'],['https://docs.opencv.org/4.2.0/d9/d00/structcv_1_1cudev_1_1MakeVec_3_01short_00_011_01_4.html#ad5e661748bb4af3388365310cbcf7119',1,'cv::cudev::MakeVec< short, 1 >::type'],['https://docs.opencv.org/4.2.0/d8/df8/structcv_1_1cudev_1_1MakeVec_3_01short_00_012_01_4.html#aef7d69b6314e8018e8a89bb7366c63fb',1,'cv::cudev::MakeVec< short, 2 >::type'],['https://docs.opencv.org/4.2.0/d6/d37/structcv_1_1cudev_1_1MakeVec_3_01short_00_013_01_4.html#a4c8257a923e78b07cc8bb5a908e12fdd',1,'cv::cudev::MakeVec< short, 3 >::type'],['https://docs.opencv.org/4.2.0/d1/da2/structcv_1_1cudev_1_1MakeVec_3_01short_00_014_01_4.html#a50305c204ab317c3981b24be1ba24266',1,'cv::cudev::MakeVec< short, 4 >::type'],['https://docs.opencv.org/4.2.0/db/de4/structcv_1_1cudev_1_1MakeVec_3_01uchar_00_011_01_4.html#a5318458d3974a8690854e7fff7c369bc',1,'cv::cudev::MakeVec< uchar, 1 >::type'],['https://docs.opencv.org/4.2.0/d0/d33/structcv_1_1cudev_1_1MakeVec_3_01uchar_00_012_01_4.html#a724d9fdf3a40fdccee9dedc50f048d8e',1,'cv::cudev::MakeVec< uchar, 2 >::type'],['https://docs.opencv.org/4.2.0/d7/d10/structcv_1_1cudev_1_1MakeVec_3_01uchar_00_013_01_4.html#adc5d6eee0d92ca86e5d28a639c963307',1,'cv::cudev::MakeVec< uchar, 3 >::type'],['https://docs.opencv.org/4.2.0/dd/dce/structcv_1_1cudev_1_1MakeVec_3_01uchar_00_014_01_4.html#a9807a06bbfb46a7fb0362f0927856d41',1,'cv::cudev::MakeVec< uchar, 4 >::type'],['https://docs.opencv.org/4.2.0/d9/d52/structcv_1_1cudev_1_1MakeVec_3_01uint_00_011_01_4.html#a8847869a3f6cb9abb08e2b51463b2775',1,'cv::cudev::MakeVec< uint, 1 >::type'],['https://docs.opencv.org/4.2.0/da/d68/structcv_1_1cudev_1_1MakeVec_3_01uint_00_012_01_4.html#a0ad56dea0099d66752310f1c6c576612',1,'cv::cudev::MakeVec< uint, 2 >::type'],['https://docs.opencv.org/4.2.0/d5/d1a/structcv_1_1cudev_1_1MakeVec_3_01uint_00_013_01_4.html#a39f46cdd3501ce5575e5cfa00b3a2a3b',1,'cv::cudev::MakeVec< uint, 3 >::type'],['https://docs.opencv.org/4.2.0/d3/df1/structcv_1_1cudev_1_1MakeVec_3_01uint_00_014_01_4.html#a5246931cd2bfcd3eb7bdb56678d899fb',1,'cv::cudev::MakeVec< uint, 4 >::type'],['https://docs.opencv.org/4.2.0/d4/d31/structcv_1_1cudev_1_1MakeVec_3_01ushort_00_011_01_4.html#a5ae4a1310d7fefdd3c3cb6f4a4f550e7',1,'cv::cudev::MakeVec< ushort, 1 >::type'],['https://docs.opencv.org/4.2.0/d3/d31/structcv_1_1cudev_1_1MakeVec_3_01ushort_00_012_01_4.html#ae99bd0ad2423cff46447a70c8779f75d',1,'cv::cudev::MakeVec< ushort, 2 >::type'],['https://docs.opencv.org/4.2.0/d4/d72/structcv_1_1cudev_1_1MakeVec_3_01ushort_00_013_01_4.html#ad62787645d0068fe2ffcd830e616b1a1',1,'cv::cudev::MakeVec< ushort, 3 >::type'],['https://docs.opencv.org/4.2.0/de/de5/structcv_1_1cudev_1_1MakeVec_3_01ushort_00_014_01_4.html#aef7573da7d54d0cf0bae3a90a7d5c59f',1,'cv::cudev::MakeVec< ushort, 4 >::type'],['https://docs.opencv.org/4.2.0/db/d79/structcv_1_1detail_1_1MetaType.html#a3294400b888903a23ea98dc5b5666f5f',1,'cv::detail::MetaType::type'],['https://docs.opencv.org/4.2.0/d4/d91/structcv_1_1detail_1_1MetaType_3_01cv_1_1GArray_3_01U_01_4_01_4.html#acc8c4a00d282678d859b1d8244d1f393',1,'cv::detail::MetaType< cv::GArray< U > >::type'],['https://docs.opencv.org/4.2.0/d0/dcf/structcv_1_1detail_1_1MetaType_3_01cv_1_1GMat_01_4.html#ae3fde27a067e489e03452436a4b0055d',1,'cv::detail::MetaType< cv::GMat >::type'],['https://docs.opencv.org/4.2.0/dc/d9f/structcv_1_1detail_1_1MetaType_3_01cv_1_1GMatP_01_4.html#a345fbf33f932ac53129c744294a428fb',1,'cv::detail::MetaType< cv::GMatP >::type'],['https://docs.opencv.org/4.2.0/de/d91/structcv_1_1detail_1_1MetaType_3_01cv_1_1GScalar_01_4.html#adba13704e7ce2d101b5e0112476bd939',1,'cv::detail::MetaType< cv::GScalar >::type'],['https://docs.opencv.org/4.2.0/dd/d51/structcv_1_1detail_1_1ProtoToMeta_3_01cv_1_1GArray_3_01U_01_4_01_4.html#a66f4135ae9b8c92a38e0ae6208ea2437',1,'cv::detail::ProtoToMeta< cv::GArray< U > >::type'],['https://docs.opencv.org/4.2.0/d0/d99/structcv_1_1detail_1_1ProtoToMeta_3_01cv_1_1GMat_01_4.html#abbf3271449ee4db6c65b91fc93868afd',1,'cv::detail::ProtoToMeta< cv::GMat >::type'],['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1detail_1_1ProtoToMeta_3_01cv_1_1GScalar_01_4.html#a2c70f67e114d74c2fbf66316c82bfd98',1,'cv::detail::ProtoToMeta< cv::GScalar >::type'],['https://docs.opencv.org/4.2.0/d5/d57/structcv_1_1detail_1_1ProtoToParam_3_01cv_1_1GArray_3_01U_01_4_01_4.html#afa7db1b0533ee857e3635c57390fee21',1,'cv::detail::ProtoToParam< cv::GArray< U > >::type'],['https://docs.opencv.org/4.2.0/dc/dc8/structcv_1_1detail_1_1ProtoToParam_3_01cv_1_1GMat_01_4.html#a6a52f9f8f5a816b52cfc447ef3aef486',1,'cv::detail::ProtoToParam< cv::GMat >::type'],['https://docs.opencv.org/4.2.0/de/d65/structcv_1_1detail_1_1ProtoToParam_3_01cv_1_1GScalar_01_4.html#ae8587e10bfee0439487befb68a8737a9',1,'cv::detail::ProtoToParam< cv::GScalar >::type'],['https://docs.opencv.org/4.2.0/d8/d1b/structcv_1_1cudev_1_1SelectIf.html#a62f051e67a8da33f598647c592aa8dc4',1,'cv::cudev::SelectIf::type'],['https://docs.opencv.org/4.2.0/dd/da7/structcv_1_1cudev_1_1SelectIf_3_01false_00_01ThenType_00_01ElseType_01_4.html#a58abc027d4ea072c5ae101256ba57655',1,'cv::cudev::SelectIf< false, ThenType, ElseType >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11447.html#adbbd8131d9a4cdc53e280a34f161dd3c',1,'__gnu_pbds::detail::container_base_dispatch< _VTp, Cmp_Fn, _Alloc, binary_heap_tag, null_type >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11439.html#ab4cecfd9b1ed21229fe049cabebe321c',1,'__gnu_pbds::detail::container_base_dispatch< _VTp, Cmp_Fn, _Alloc, binomial_heap_tag, null_type >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11435.html#adecf3a56bd35a5ca376d0492e7123a7b',1,'__gnu_pbds::detail::container_base_dispatch< _VTp, Cmp_Fn, _Alloc, pairing_heap_tag, null_type >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11443.html#a7d1df51ac2b0c2e893e450bf7fe9e379',1,'__gnu_pbds::detail::container_base_dispatch< _VTp, Cmp_Fn, _Alloc, rc_binomial_heap_tag, null_type >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11451.html#a9810405868a4fa2e115def4f7da71b66',1,'__gnu_pbds::detail::container_base_dispatch< _VTp, Cmp_Fn, _Alloc, thin_heap_tag, null_type >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11419.html#a23615b62e54e710b3434f9fa1ec9e3d1',1,'__gnu_pbds::detail::container_base_dispatch< Key, Mapped, _Alloc, cc_hash_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11427.html#abd5c9e94abb13133205d4974cb2c396f',1,'__gnu_pbds::detail::container_base_dispatch< Key, Mapped, _Alloc, gp_hash_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11379.html#acdf7426a920b3c4b7e483cd738099f08',1,'__gnu_pbds::detail::container_base_dispatch< Key, Mapped, _Alloc, list_update_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11411.html#a9dee3e80b552749aba49a387cfef6768',1,'__gnu_pbds::detail::container_base_dispatch< Key, Mapped, _Alloc, ov_tree_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11395.html#a4dc67d36e7e28cebbf0696edd715d8a6',1,'__gnu_pbds::detail::container_base_dispatch< Key, Mapped, _Alloc, rb_tree_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11403.html#a7539df56bb60708acd2660656ceee4a8',1,'__gnu_pbds::detail::container_base_dispatch< Key, Mapped, _Alloc, splay_tree_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11423.html#a3ecac13ca9bd3607b2cc2aba336c4c2c',1,'__gnu_pbds::detail::container_base_dispatch< Key, null_type, _Alloc, cc_hash_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11431.html#a315c9e64b8e3cf04bf9ca02ca72e5914',1,'__gnu_pbds::detail::container_base_dispatch< Key, null_type, _Alloc, gp_hash_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11383.html#a3567565c4791014129d9271f665960dd',1,'__gnu_pbds::detail::container_base_dispatch< Key, null_type, _Alloc, list_update_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11415.html#ac19add69b1550d2db0c651b84634ddca',1,'__gnu_pbds::detail::container_base_dispatch< Key, null_type, _Alloc, ov_tree_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11391.html#a52af7516d4c19d6fe0a0cbd61c047eb8',1,'__gnu_pbds::detail::container_base_dispatch< Key, null_type, _Alloc, pat_trie_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11407.html#a1d218c006e5fec5f988d65044d11b85f',1,'__gnu_pbds::detail::container_base_dispatch< Key, null_type, _Alloc, splay_tree_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11463.html#acf71610ce6c7a4a66b87e61fbc3e7407',1,'__gnu_pbds::detail::default_comb_hash_fn::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11459.html#a504bba9208637bab17e2da42601884ba',1,'__gnu_pbds::detail::default_eq_fn::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11455.html#a9d4935ab2b6d39c2dd35d2d6d395b45a',1,'__gnu_pbds::detail::default_hash_fn::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11475.html#a37d9371e79bf6ce01e4bdcc723df1017',1,'__gnu_pbds::detail::default_probe_fn::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11467.html#a76f207395a752f928b216799653b005d',1,'__gnu_pbds::detail::default_resize_policy::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11483.html#a3d7eb49d274057829afe1bce8418ca14',1,'__gnu_pbds::detail::default_trie_access_traits< std::basic_string< Char, Char_Traits, std::allocator< char > > >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11471.html#a386b5f8ac62032f7854bec47c859d9b8',1,'__gnu_pbds::detail::default_update_policy::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11579.html#aec3a9bedeb284ef0b99f1a279adae4c3',1,'__gnu_pbds::detail::entry_cmp< _VTp, Cmp_Fn, _Alloc, true >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04211.html#a27bdde80c654d1c5253c899d71c8885c',1,'std::aligned_union::type'],['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html#a8cadd5042039048f71cf93b124bd6ae1',1,'cv::gapi::fluid::Border::type'],['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#ae716a59c79a20a2a2660096d1dd47b18',1,'cv::datasets::GR_skigObj::type'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a5f3cdb2524e281094e14e212a76a2d38',1,'cv::dnn::Layer::type'],['https://docs.opencv.org/4.2.0/db/db6/classcv_1_1dnn_1_1LayerParams.html#a0dbcba5635f513704ca7adc9cf6eff78',1,'cv::dnn::LayerParams::type'],['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#a3e337cb0a0f44b15570db74e19734319',1,'cv::dnn::LRNLayer::type'],['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#aeb8ea847034d9ffc4383463b8bc9cf51',1,'cv::viz::MouseEvent::type'],['https://docs.opencv.org/4.2.0/db/d0d/structcv_1_1ParamType_3_01__Tp_00_01typename_01std_1_1enable__if_3_01std_1_1is__enum_3_01__Tp_01_4_1_1value_01_4_1_1type_01_4.html#a755920f56cc55a3b84639a239cd8a693',1,'cv::ParamType< _Tp, typename std::enable_if< std::is_enum< _Tp >::value >::type >::type'],['https://docs.opencv.org/4.2.0/d2/d39/structcv_1_1ParamType_3_01Algorithm_01_4.html#a9beda664abde9aea9f7fff830efd45d5',1,'cv::ParamType< Algorithm >::type'],['https://docs.opencv.org/4.2.0/d1/d87/structcv_1_1ParamType_3_01bool_01_4.html#a5610b45e4cd056719b4adcce0eb3ca6d',1,'cv::ParamType< bool >::type'],['https://docs.opencv.org/4.2.0/d4/d98/structcv_1_1ParamType_3_01double_01_4.html#a660d6da1905d6629a751bc7f42e9385d',1,'cv::ParamType< double >::type'],['https://docs.opencv.org/4.2.0/dd/df2/structcv_1_1ParamType_3_01float_01_4.html#a92a7b876f64901f0de84324ee6cbc591',1,'cv::ParamType< float >::type'],['https://docs.opencv.org/4.2.0/db/d5f/structcv_1_1ParamType_3_01Mat_01_4.html#af3d584cd4298ae018142ef42646cc10a',1,'cv::ParamType< Mat >::type'],['https://docs.opencv.org/4.2.0/d2/dda/structcv_1_1ParamType_3_01Scalar_01_4.html#a7fc7375ade85917f5ced53fe367dc32b',1,'cv::ParamType< Scalar >::type'],['https://docs.opencv.org/4.2.0/dc/d1c/structcv_1_1ParamType_3_01std_1_1vector_3_01Mat_01_4_01_4.html#aa6210114e54ac35e2477513ecb02ea2a',1,'cv::ParamType< std::vector< Mat > >::type'],['https://docs.opencv.org/4.2.0/d0/d5f/structcv_1_1ParamType_3_01String_01_4.html#a8bbf1a9470dc13d3a3dff28e03a026a1',1,'cv::ParamType< String >::type'],['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1ParamType_3_01uchar_01_4.html#adf7b7b3ab6eb496d6817b093e4fcb09e',1,'cv::ParamType< uchar >::type'],['https://docs.opencv.org/4.2.0/dc/d63/structcv_1_1ParamType_3_01uint64_01_4.html#a9592ae25ee7b861fe339eb07bd4d10ed',1,'cv::ParamType< uint64 >::type'],['https://docs.opencv.org/4.2.0/d7/d68/structcv_1_1ParamType_3_01unsigned_01_4.html#a4f8b9f217561fdd22bca401c47526b62',1,'cv::ParamType< unsigned >::type'],['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a0cb63164efd77bbfabd77ff68ea5ce8d',1,'cv::dnn::PoolingLayer::type'],['https://docs.opencv.org/4.2.0/d7/d56/structcv_1_1datasets_1_1SLAM__tumindoorObj.html#a351c8eb553d89b00cb00a6dac0cd2107',1,'cv::datasets::SLAM_tumindoorObj::type'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a1ab7160b93aac1aa5ae015560d6fa5ae',1,'cv::TermCriteria::type'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a908ed821dcfd03b5cd1de763885537a3',1,'cv::Subdiv2D::Vertex::type'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#aad62862c81d1d5bdf3f6597a32585844',1,'cv::_InputArray::type()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#acdbc4c711bfbf0c8be705398e4ca583e',1,'cv::ogl::Buffer::type()'],['https://docs.opencv.org/4.2.0/dc/d89/structcv_1_1flann_1_1CvType_3_01char_01_4.html#a3bb1d61d10c2013d99637a15fe327569',1,'cv::flann::CvType< char >::type()'],['https://docs.opencv.org/4.2.0/dc/d69/structcv_1_1flann_1_1CvType_3_01double_01_4.html#a2f87d947b1f72e0c80650fc657e1cbec',1,'cv::flann::CvType< double >::type()'],['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1flann_1_1CvType_3_01float_01_4.html#ae7bbff9f8eb419211f60dba3fb96bd04',1,'cv::flann::CvType< float >::type()'],['https://docs.opencv.org/4.2.0/d2/def/structcv_1_1flann_1_1CvType_3_01short_01_4.html#a578abd72b21a13835ad2539c4b09751b',1,'cv::flann::CvType< short >::type()'],['https://docs.opencv.org/4.2.0/d7/da5/structcv_1_1flann_1_1CvType_3_01unsigned_01char_01_4.html#aa68ea25cde8d8bdbab5ab3c1856a4b68',1,'cv::flann::CvType< unsigned char >::type()'],['https://docs.opencv.org/4.2.0/d9/d57/structcv_1_1flann_1_1CvType_3_01unsigned_01short_01_4.html#ab4c8c75d6aa55b00f8edc13f7e5368be',1,'cv::flann::CvType< unsigned short >::type()'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ac8cfab2ef82010b6505683000e3652f7',1,'cv::ocl::Device::type()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ad0fd448e25719a94320ebe574b87f997',1,'cv::FileNode::type()'],['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#a0d183c893967e06ed760d7d2dd4f4669',1,'cv::optflow::GPCTrainingSamples::type()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ab0c835e86e2af3c8fc14fee8a2937281',1,'cv::cuda::GpuMat::type()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#aca78acd1e054a20caf3427c2a36e898e',1,'cv::cudev::GpuMat_::type()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ac55673be0aa82cc6dbe7b17cf2c480ce',1,'cv::cuda::HostMem::type()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af2d2652e552d7de635988f18a84b53e5',1,'cv::Mat::type()'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#abff622ef7ef3019c18800de316c08963',1,'cv::gapi::own::Mat::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'cv::Mat_::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< double >::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< float >::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< uchar >::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< unsigned char >::type()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a65fb8ae8f21a136edfe6da122c5466fb',1,'cv::MatExpr::type()'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ac9fe29306a3f2243d2596180a37f4281',1,'cv::MatOp::type()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a3331bffc1409d61631d223169a950b25',1,'cv::SparseMat::type()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#abcd902283fa4eb7556499d0729196b30',1,'cv::SparseMat_::type()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a65194dd922bef59b349a4148cd39d675',1,'cv::UMat::type()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a283ebc4f962a66404be06dcbb512eff4',1,'std::experimental::fundamentals_v1::any::type()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5b7c4b35a0ad9f97474912a08965d7ad.html#a5b7c4b35a0ad9f97474912a08965d7ad',1,'nlohmann::basic_json::type()']]], - ['type_712',['TYPE',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07',1,'cv::instr']]], - ['type_713',['Type-safe container of any type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html',1,'']]], - ['type_20safe_20container_20of_20any_20type_714',['Type-safe container of any type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html',1,'']]], - ['type1_715',['type1',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#a32db8f0b08a582326de2ecc1e2baea10',1,'cv::datasets::HPE_humanevaObj']]], - ['type2_716',['type2',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#a6f03ab1a7944ee6a50a81404b8760e77',1,'cv::datasets::HPE_humanevaObj']]], - ['type_5f5_5f8_717',['TYPE_5_8',['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08a16aa140499fc16449dfae5f095dc475c',1,'cv::FastFeatureDetector']]], - ['type_5f7_5f12_718',['TYPE_7_12',['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08af4be71a038c46401a0b431fcc994900d',1,'cv::FastFeatureDetector']]], - ['type_5f9_5f16_719',['TYPE_9_16',['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08a7a1af523673c330d43ec47081bcc55e3',1,'cv::FastFeatureDetector']]], - ['type_5faccelerator_720',['TYPE_ACCELERATOR',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2a3e0bdde0459301ccb652c1387997ae07',1,'cv::ocl::Device']]], - ['type_5fall_721',['TYPE_ALL',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2af32644a14837526000cb67fe3331fa10',1,'cv::ocl::Device']]], - ['type_5fbase_722',['type_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11539.html',1,'__gnu_pbds::detail']]], - ['type_5fbase_3c_20key_2c_20mapped_2c_20_5falloc_2c_20false_20_3e_723',['type_base< Key, Mapped, _Alloc, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11543.html',1,'__gnu_pbds::detail']]], - ['type_5fbase_3c_20key_2c_20mapped_2c_20_5falloc_2c_20true_20_3e_724',['type_base< Key, Mapped, _Alloc, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11547.html',1,'__gnu_pbds::detail']]], - ['type_5fbase_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20false_20_3e_725',['type_base< Key, null_type, _Alloc, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11551.html',1,'__gnu_pbds::detail']]], - ['type_5fbase_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20true_20_3e_726',['type_base< Key, null_type, _Alloc, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11555.html',1,'__gnu_pbds::detail']]], - ['type_5fcpu_727',['TYPE_CPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2ae3f66c5131806996dd0a77dcc27b5cdb',1,'cv::ocl::Device']]], - ['type_5fdefault_728',['TYPE_DEFAULT',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2a85e501bfc1d0b86cc5a00b3231169594',1,'cv::ocl::Device']]], - ['type_5fdgpu_729',['TYPE_DGPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2ade0b46bcd7730a122fc2db365d46f134',1,'cv::ocl::Device']]], - ['type_5fdispatch_730',['type_dispatch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11559.html',1,'__gnu_pbds::detail']]], - ['type_5ferror_731',['type_error',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ace5bf851eafe85bd6332f978991bc11c.html#ace5bf851eafe85bd6332f978991bc11c',1,'nlohmann::basic_json']]], - ['type_5ffun_732',['TYPE_FUN',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a76e4e851a896def5b60f25367f44ac6f',1,'cv::instr']]], - ['type_5fgeneral_733',['TYPE_GENERAL',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a289321828657503ab1539ad17904a925',1,'cv::instr']]], - ['type_5fgpu_734',['TYPE_GPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2aeb33963824886f155640fbcaef41d31f',1,'cv::ocl::Device']]], - ['type_5figpu_735',['TYPE_IGPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2a5a9bc4ea9b8ef84cd24a3289e4bd2d9d',1,'cv::ocl::Device']]], - ['type_5findex_736',['type_index',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03047.html',1,'std']]], - ['type_5finfo_737',['type_info',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01679.html',1,'std']]], - ['type_5flist_5findex_738',['type_list_index',['https://docs.opencv.org/4.2.0/d4/d46/structcv_1_1util_1_1type__list__index.html',1,'cv::util']]], - ['type_5flist_5findex_5fhelper_739',['type_list_index_helper',['https://docs.opencv.org/4.2.0/d1/d34/structcv_1_1util_1_1detail_1_1type__list__index__helper.html',1,'cv::util::detail']]], - ['type_5flist_5findex_5fhelper_3c_20i_2c_20target_2c_20first_20_3e_740',['type_list_index_helper< I, Target, First >',['https://docs.opencv.org/4.2.0/df/dfa/structcv_1_1util_1_1detail_1_1type__list__index__helper_3_01I_00_01Target_00_01First_01_4.html',1,'cv::util::detail']]], - ['type_5fmarker_741',['TYPE_MARKER',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a0025497a8b803c1564fa60d01c628247',1,'cv::instr']]], - ['type_5fmask_742',['TYPE_MASK',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a7367dc60b8963971f3c8f34dc075ebd6',1,'cv::FileNode::TYPE_MASK'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa6207c8cf9a3e442f153dc0241aea600a03b3e6a1defa1189b67c9f3d70b7c448',1,'cv::Mat::TYPE_MASK'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a6ecf93c4dac94616b02918ad5b3892d5abb9b861c1d3e39f5d4194c49c44c3c90',1,'cv::gapi::own::detail::MatHeader::TYPE_MASK'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a253082dc73b6e195968b5cd6ad10c71bacfda75d2f03eb3b2dc71e9654b5bef46',1,'cv::UMat::TYPE_MASK']]], - ['type_5fname_743',['type_name',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a459dbfcd47bd632ca82ca8ff8db278c8.html#a459dbfcd47bd632ca82ca8ff8db278c8',1,'nlohmann::basic_json']]], - ['type_5ftraits_744',['type_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00167.html',1,'']]], - ['type_5ftraits_2eh_745',['type_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01097.html',1,'']]], - ['type_5ftraits_2ehpp_746',['type_traits.hpp',['https://docs.opencv.org/4.2.0/d8/dbd/modules_2core_2include_2opencv2_2core_2cuda_2type__traits_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/daf/contrib_2modules_2cudev_2include_2opencv2_2cudev_2util_2type__traits_8hpp.html',1,'(Global Namespace)']]], - ['type_5futils_2ehpp_747',['type_utils.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01157.html',1,'']]], - ['type_5fwrapper_748',['TYPE_WRAPPER',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a3bb468f2996912301469d76be784c183',1,'cv::instr']]], - ['typedefs_749',['typedefs',['https://eigen.tuxfamily.org/dox/group__alignedboxtypedefs.html',1,'Global aligned box typedefs'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html',1,'Global array typedefs'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html',1,'Global matrix typedefs']]], - ['typehint_750',['TypeHint',['https://docs.opencv.org/4.2.0/df/dc2/structcv_1_1detail_1_1TypeHint.html',1,'cv::detail']]], - ['typehintbase_751',['TypeHintBase',['https://docs.opencv.org/4.2.0/d6/de4/structcv_1_1detail_1_1TypeHintBase.html',1,'cv::detail']]], - ['typeindex_752',['typeindex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00164.html',1,'']]], - ['typeinfo_753',['typeinfo',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00035.html',1,'']]], - ['typelist_2eh_754',['typelist.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01100.html',1,'']]], - ['typename_20keywords_20in_20c_755',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], - ['types_756',['G-API Data Types',['https://docs.opencv.org/4.2.0/db/df1/group__gapi__data__objects.html',1,'']]], - ['types_757',['Scalar types',['https://eigen.tuxfamily.org/dox/TopicScalarTypes.html',1,'']]], - ['types_758',['Types',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a22a5db4ceb750ca68782ddb32f44562f',1,'cv::ml::Boost::Types'],['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ad993005b665024ea3c067c4cccd4e898',1,'cv::ml::EM::Types'],['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#ab654e56b6b5b0745022b7ca054ef2c1c',1,'cv::ml::KNearest::Types'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44f',1,'cv::ml::SVM::Types']]], - ['types_759',['Using custom scalar types',['https://eigen.tuxfamily.org/dox/TopicCustomizing_CustomScalar.html',1,'']]], - ['types_20as_20parameters_760',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], - ['types_2eh_761',['types.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00977.html',1,'']]], - ['types_2ehpp_762',['types.hpp',['https://docs.opencv.org/4.2.0/db/dfc/modules_2core_2include_2opencv2_2core_2types_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d61/modules_2gapi_2include_2opencv2_2gapi_2own_2types_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d07/contrib_2modules_2fuzzy_2include_2opencv2_2fuzzy_2types_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d0e/contrib_2modules_2viz_2include_2opencv2_2viz_2types_8hpp.html',1,'(Global Namespace)']]], - ['types_5ftraits_763',['types_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11563.html',1,'__gnu_pbds::detail']]], - ['types_5ftraits_2ehpp_764',['types_traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01160.html',1,'']]], - ['types_5ftraits_3c_20key_2c_20mapped_2c_20_5falloc_2c_20false_20_3e_765',['types_traits< Key, Mapped, _Alloc, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11563.html',1,'']]], - ['typesequals_766',['TypesEquals',['https://docs.opencv.org/4.2.0/df/d71/structcv_1_1cudev_1_1TypesEquals.html',1,'cv::cudev']]], - ['typesequals_3c_20a_2c_20a_20_3e_767',['TypesEquals< A, A >',['https://docs.opencv.org/4.2.0/df/dbf/structcv_1_1cudev_1_1TypesEquals_3_01A_00_01A_01_4.html',1,'cv::cudev']]], - ['typetostr_768',['typeToStr',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga332498ad6301e733151ff4e61e0d755c',1,'cv::ocl::typeToStr()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga332498ad6301e733151ff4e61e0d755c',1,'typeToStr()(Global Namespace)']]], - ['typetostring_769',['typeToString',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a2b314c09591d8f79c334b7fd9dd3a9fd',1,'cv']]], - ['typetraits_770',['TypeTraits',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html',1,'cv::cudev']]] + ['tag_5fand_5ftrait_2ehpp_34',['tag_and_trait.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01130.html',1,'']]], + ['tags_35',['Tags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01514.html',1,'Iterator Tags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01537.html',1,'Tags']]], + ['tags_36',['tags',['https://docs.opencv.org/4.2.0/d3/dc5/structcv_1_1datasets_1_1TR__svtObj.html#a892c16af64349c67cdad745004bc7ff7',1,'cv::datasets::TR_svtObj']]], + ['tags_2eh_37',['tags.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00974.html',1,'']]], + ['taking_20eigen_20types_20as_20parameters_38',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], + ['tan_39',['tan',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e5d0b49532d508cf28945e99479dc2e',1,'cv::cudev::tan(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa42448e9d066933568fd36858c124274',1,'cv::cudev::tan(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9b3f9080bab2c5faa052696940f9e3b',1,'cv::cudev::tan(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35550b9a68d4214e3c9701219d42e42f',1,'cv::cudev::tan(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0d5d2dc1b65a22f7aad7160be6caf34',1,'cv::cudev::tan(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab2861d06ea28098768c411c4a004bda',1,'cv::cudev::tan(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffbd6e5d1c6422ce0fa5cd0eefa0642a',1,'cv::cudev::tan(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfaabdc3b38246f96af7222ba86ea236',1,'cv::cudev::tan(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68848db541101ea8520d54ebb6dee279',1,'cv::cudev::tan(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02ae4c03d049fd2d3dfc63c6e6b7fe7f',1,'cv::cudev::tan(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3b7587a9b79be1c5204e13c806acb99',1,'cv::cudev::tan(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3be145ff237e2f1f8629ad62c05c697',1,'cv::cudev::tan(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb155f64a156b28136180f800aee544b',1,'cv::cudev::tan(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed79335a1296246d7e8c42e4edca7cc6',1,'cv::cudev::tan(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd6605162340e91ccc8020655e2f4bac',1,'cv::cudev::tan(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38dfd86d8b6fd18e875c9b7705740ebc',1,'cv::cudev::tan(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbc07cfcdc67d2d74a3b289631431df6',1,'cv::cudev::tan(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ecf20bcddbbe86ae86f921d18d26c88',1,'cv::cudev::tan(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga563c15a76c2beccc8b9e2900a916afc8',1,'cv::cudev::tan(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d93d71234de0828eb63a32d26d869f3',1,'cv::cudev::tan(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga272faade7192828c455c3981530550c4',1,'cv::cudev::tan(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034eba2156aac018f8893dad0d12c1a4',1,'cv::cudev::tan(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa70635fd8b6e9fbe5d8724fd1379ab0d',1,'cv::cudev::tan(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e73678ae8db76dfdab09330a73b4f40',1,'cv::cudev::tan(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6600a1b5c1e762f8eccebbc83e3d83d',1,'cv::cudev::tan(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga343aeebb955e6b8ade7c81de2b503a3f',1,'cv::cudev::tan(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga321bd881717a99b5ce57c6979c7ac812',1,'cv::cudev::tan(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e6bb2a47b4930d3f598a16d12bc8cee',1,'cv::cudev::tan(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a816be188964e277c8505b169def45b',1,'cv::cudev::tan(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf966a66ec4dae52d7c54a783eb143740',1,'cv::cudev::tan(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga354b53c655eeaaa0cdb34c731550a18d',1,'cv::cudev::tan(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8c860990267c06b55433e94667d00df',1,'cv::cudev::tan(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e5d0b49532d508cf28945e99479dc2e',1,'tan(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa42448e9d066933568fd36858c124274',1,'tan(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9b3f9080bab2c5faa052696940f9e3b',1,'tan(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35550b9a68d4214e3c9701219d42e42f',1,'tan(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0d5d2dc1b65a22f7aad7160be6caf34',1,'tan(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab2861d06ea28098768c411c4a004bda',1,'tan(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffbd6e5d1c6422ce0fa5cd0eefa0642a',1,'tan(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfaabdc3b38246f96af7222ba86ea236',1,'tan(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68848db541101ea8520d54ebb6dee279',1,'tan(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02ae4c03d049fd2d3dfc63c6e6b7fe7f',1,'tan(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3b7587a9b79be1c5204e13c806acb99',1,'tan(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3be145ff237e2f1f8629ad62c05c697',1,'tan(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb155f64a156b28136180f800aee544b',1,'tan(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed79335a1296246d7e8c42e4edca7cc6',1,'tan(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd6605162340e91ccc8020655e2f4bac',1,'tan(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38dfd86d8b6fd18e875c9b7705740ebc',1,'tan(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbc07cfcdc67d2d74a3b289631431df6',1,'tan(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ecf20bcddbbe86ae86f921d18d26c88',1,'tan(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga563c15a76c2beccc8b9e2900a916afc8',1,'tan(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d93d71234de0828eb63a32d26d869f3',1,'tan(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga272faade7192828c455c3981530550c4',1,'tan(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034eba2156aac018f8893dad0d12c1a4',1,'tan(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa70635fd8b6e9fbe5d8724fd1379ab0d',1,'tan(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e73678ae8db76dfdab09330a73b4f40',1,'tan(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6600a1b5c1e762f8eccebbc83e3d83d',1,'tan(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga343aeebb955e6b8ade7c81de2b503a3f',1,'tan(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga321bd881717a99b5ce57c6979c7ac812',1,'tan(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e6bb2a47b4930d3f598a16d12bc8cee',1,'tan(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a816be188964e277c8505b169def45b',1,'tan(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf966a66ec4dae52d7c54a783eb143740',1,'tan(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga354b53c655eeaaa0cdb34c731550a18d',1,'tan(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8c860990267c06b55433e94667d00df',1,'tan(const double1 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga530419a3cf68024cd03985a4795214e3',1,'std::tan()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga530419a3cf68024cd03985a4795214e3',1,'tan()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a3bc116a6243f38c22f851581aa7b521a',1,'Eigen::tan()']]], + ['tan_5f_40',['tan_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6dec9edbdc5eb832badd1e8a0f64bf2f',1,'cv::cudev::tan_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6dec9edbdc5eb832badd1e8a0f64bf2f',1,'tan_()(Global Namespace)']]], + ['tan_5ffunc_41',['tan_func',['https://docs.opencv.org/4.2.0/d7/d3e/structcv_1_1cudev_1_1tan__func.html',1,'cv::cudev']]], + ['tan_5ffunc_3c_20double_20_3e_42',['tan_func< double >',['https://docs.opencv.org/4.2.0/db/dc4/structcv_1_1cudev_1_1tan__func_3_01double_01_4.html',1,'cv::cudev']]], + ['tan_5ffunc_3c_20float_20_3e_43',['tan_func< float >',['https://docs.opencv.org/4.2.0/d5/d4e/structcv_1_1cudev_1_1tan__func_3_01float_01_4.html',1,'cv::cudev']]], + ['tan_5ffunc_3c_20schar_20_3e_44',['tan_func< schar >',['https://docs.opencv.org/4.2.0/d7/d9d/structcv_1_1cudev_1_1tan__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['tan_5ffunc_3c_20short_20_3e_45',['tan_func< short >',['https://docs.opencv.org/4.2.0/d6/dbd/structcv_1_1cudev_1_1tan__func_3_01short_01_4.html',1,'cv::cudev']]], + ['tan_5ffunc_3c_20uchar_20_3e_46',['tan_func< uchar >',['https://docs.opencv.org/4.2.0/d2/d0d/structcv_1_1cudev_1_1tan__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['tan_5ffunc_3c_20uint_20_3e_47',['tan_func< uint >',['https://docs.opencv.org/4.2.0/d6/d9e/structcv_1_1cudev_1_1tan__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['tan_5ffunc_3c_20ushort_20_3e_48',['tan_func< ushort >',['https://docs.opencv.org/4.2.0/d2/d63/structcv_1_1cudev_1_1tan__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['tanh_49',['tanh',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c3552307e19fc605da2e9701059f7d4',1,'cv::cudev::tanh(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c5395068317219fd153592b8ad9336',1,'cv::cudev::tanh(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58dea08dd173dcdedd59a006e7ca07cb',1,'cv::cudev::tanh(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ee6a8eee9ed53b87443f9492ca613cf',1,'cv::cudev::tanh(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga867e1d2329bf43d6cde7980fdca51559',1,'cv::cudev::tanh(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa393aec6df5d816067b8a145f95acfdb',1,'cv::cudev::tanh(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga194a2fb5810da42d7d787d4f0cfcd290',1,'cv::cudev::tanh(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8de54e2fea59ac5ef67c180f18caefdd',1,'cv::cudev::tanh(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cedaa513222ede70653b1087ac95e6e',1,'cv::cudev::tanh(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a7af2fc1aca6c890ef8df791aa7b0cc',1,'cv::cudev::tanh(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga778d8707774a42fc0cf65d3010b5f474',1,'cv::cudev::tanh(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b532c589eaa2b8828b02cfa1ff0a25b',1,'cv::cudev::tanh(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39eb534ba2c0c6a1f77ffca705b506c7',1,'cv::cudev::tanh(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfdaeb04492a6fabb75d147ea5831417',1,'cv::cudev::tanh(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60caf9e7c3a45201f3245966b599985e',1,'cv::cudev::tanh(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dd2b3295f8ca282c3c8d1e1eeadf6f7',1,'cv::cudev::tanh(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae28e056d1a28f8814d54344ddd2d2dc1',1,'cv::cudev::tanh(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48568accf1cd935c47237c0f9a0b5a6e',1,'cv::cudev::tanh(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e22e66070d0b20442d4282d775ea290',1,'cv::cudev::tanh(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12dfdbac4e66ff3d2a89b688ad38d771',1,'cv::cudev::tanh(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4acd792684185e5ec114fa844a038a90',1,'cv::cudev::tanh(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac146d362245aae4b500580de8e030f05',1,'cv::cudev::tanh(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59379080668d13417552a24405a749c0',1,'cv::cudev::tanh(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae263d03c6ff173d9f52f1bff13cd3070',1,'cv::cudev::tanh(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3dc0a9f3176569af757a5271046440f',1,'cv::cudev::tanh(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2a279d830a6e0e6ee9f81ebdfd48867',1,'cv::cudev::tanh(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37a5ec47f29fc9c5f077f81d75edacce',1,'cv::cudev::tanh(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d490f73a043e8b6c88c27d7c43dbfd8',1,'cv::cudev::tanh(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98ad8c427568c85682202726982cf73f',1,'cv::cudev::tanh(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98f4cdfe2c246ff6738754c976db85b9',1,'cv::cudev::tanh(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga180f392bae31b013c454f9b94538b180',1,'cv::cudev::tanh(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7bd8b3c6ec4cc7f60fd287272706bb2',1,'cv::cudev::tanh(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c3552307e19fc605da2e9701059f7d4',1,'tanh(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c5395068317219fd153592b8ad9336',1,'tanh(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58dea08dd173dcdedd59a006e7ca07cb',1,'tanh(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ee6a8eee9ed53b87443f9492ca613cf',1,'tanh(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga867e1d2329bf43d6cde7980fdca51559',1,'tanh(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa393aec6df5d816067b8a145f95acfdb',1,'tanh(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga194a2fb5810da42d7d787d4f0cfcd290',1,'tanh(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8de54e2fea59ac5ef67c180f18caefdd',1,'tanh(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cedaa513222ede70653b1087ac95e6e',1,'tanh(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a7af2fc1aca6c890ef8df791aa7b0cc',1,'tanh(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga778d8707774a42fc0cf65d3010b5f474',1,'tanh(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b532c589eaa2b8828b02cfa1ff0a25b',1,'tanh(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39eb534ba2c0c6a1f77ffca705b506c7',1,'tanh(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfdaeb04492a6fabb75d147ea5831417',1,'tanh(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60caf9e7c3a45201f3245966b599985e',1,'tanh(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dd2b3295f8ca282c3c8d1e1eeadf6f7',1,'tanh(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae28e056d1a28f8814d54344ddd2d2dc1',1,'tanh(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48568accf1cd935c47237c0f9a0b5a6e',1,'tanh(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e22e66070d0b20442d4282d775ea290',1,'tanh(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12dfdbac4e66ff3d2a89b688ad38d771',1,'tanh(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4acd792684185e5ec114fa844a038a90',1,'tanh(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac146d362245aae4b500580de8e030f05',1,'tanh(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59379080668d13417552a24405a749c0',1,'tanh(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae263d03c6ff173d9f52f1bff13cd3070',1,'tanh(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3dc0a9f3176569af757a5271046440f',1,'tanh(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2a279d830a6e0e6ee9f81ebdfd48867',1,'tanh(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37a5ec47f29fc9c5f077f81d75edacce',1,'tanh(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d490f73a043e8b6c88c27d7c43dbfd8',1,'tanh(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98ad8c427568c85682202726982cf73f',1,'tanh(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98f4cdfe2c246ff6738754c976db85b9',1,'tanh(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga180f392bae31b013c454f9b94538b180',1,'tanh(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7bd8b3c6ec4cc7f60fd287272706bb2',1,'tanh(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaa4aa5a5b2f39aa309bd0add4864b3155',1,'std::tanh()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaa4aa5a5b2f39aa309bd0add4864b3155',1,'tanh()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a0110c233d357169fd58fdf5656992a98',1,'Eigen::tanh()']]], + ['tanh_5f_50',['tanh_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ec3ed1ce39a2701c6ef836791be8c25',1,'cv::cudev::tanh_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ec3ed1ce39a2701c6ef836791be8c25',1,'tanh_()(Global Namespace)']]], + ['tanh_5ffunc_51',['tanh_func',['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1tanh__func.html',1,'cv::cudev']]], + ['tanh_5ffunc_3c_20double_20_3e_52',['tanh_func< double >',['https://docs.opencv.org/4.2.0/d4/d9f/structcv_1_1cudev_1_1tanh__func_3_01double_01_4.html',1,'cv::cudev']]], + ['tanh_5ffunc_3c_20float_20_3e_53',['tanh_func< float >',['https://docs.opencv.org/4.2.0/dc/da0/structcv_1_1cudev_1_1tanh__func_3_01float_01_4.html',1,'cv::cudev']]], + ['tanh_5ffunc_3c_20schar_20_3e_54',['tanh_func< schar >',['https://docs.opencv.org/4.2.0/d5/dfc/structcv_1_1cudev_1_1tanh__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['tanh_5ffunc_3c_20short_20_3e_55',['tanh_func< short >',['https://docs.opencv.org/4.2.0/d8/db4/structcv_1_1cudev_1_1tanh__func_3_01short_01_4.html',1,'cv::cudev']]], + ['tanh_5ffunc_3c_20uchar_20_3e_56',['tanh_func< uchar >',['https://docs.opencv.org/4.2.0/d8/d5a/structcv_1_1cudev_1_1tanh__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['tanh_5ffunc_3c_20uint_20_3e_57',['tanh_func< uint >',['https://docs.opencv.org/4.2.0/df/dc6/structcv_1_1cudev_1_1tanh__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['tanh_5ffunc_3c_20ushort_20_3e_58',['tanh_func< ushort >',['https://docs.opencv.org/4.2.0/d6/d68/structcv_1_1cudev_1_1tanh__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['tanhlayer_59',['TanHLayer',['https://docs.opencv.org/4.2.0/df/d66/classcv_1_1dnn_1_1TanHLayer.html',1,'cv::dnn']]], + ['target_60',['Target',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a830568a629457171cb07918537ec66be',1,'cv::ogl::Buffer::Target'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga709af7692ba29788182cf573531b0ff5',1,'cv::dnn::Target'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga709af7692ba29788182cf573531b0ff5',1,'Target(Global Namespace)']]], + ['target_61',['target',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a35397202fc2bfb04958450d0a02836d3',1,'std::function< _Res(_ArgTypes...)>::target() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a1ec2969ae6cf0413547dab469503c843',1,'std::function< _Res(_ArgTypes...)>::target() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a35397202fc2bfb04958450d0a02836d3',1,'std::function< _Res(_ArgTypes...)>::target() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a1ec2969ae6cf0413547dab469503c843',1,'std::function< _Res(_ArgTypes...)>::target() const noexcept']]], + ['target_5ftype_62',['target_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a68e477681a31511e5586cd30e7642a51',1,'std::function< _Res(_ArgTypes...)>']]], + ['targetarchs_63',['TargetArchs',['https://docs.opencv.org/4.2.0/d9/dee/classcv_1_1cuda_1_1TargetArchs.html',1,'cv::cuda']]], + ['targetheight_64',['targetHeight',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html#ab68aff8db4139bcc72c69a465fcf9304',1,'cv::TrackerTargetState']]], + ['targetid_65',['targetId',['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#af874ec283d3710ba56945a063fddd197',1,'cv::dnn::BackendWrapper']]], + ['targetnum_66',['targetNum',['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html#a9438c65176206878a155f31125ab032f',1,'cv::MultiTracker_Alt']]], + ['targetposition_67',['targetPosition',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html#ac571d40455d89b8976f7464899fa728a',1,'cv::TrackerTargetState']]], + ['targetwidth_68',['targetWidth',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html#ab2995ab3a248e933a21084faf17ac570',1,'cv::TrackerTargetState']]], + ['task_69',['task',['../classnet_1_1mc_1_1tasks_1_1CameraStreamTask.html#ad68f6be566751c9d5b5db67cd65a590e',1,'net::mc::tasks::CameraStreamTask::task()'],['../classutil_1_1AsyncTask.html#a04d4142e57b8738b26f16bc73e9d3962',1,'util::AsyncTask::task()'],['../classutil_1_1PeriodicTask.html#a3bc1c0ba21e0428d03a0485be52d765b',1,'util::PeriodicTask::task()']]], + ['tbl_70',['tbl',['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html#a5f8f32f51813e4750514ff2d33e12384',1,'cv::cudev::LutPtr']]], + ['tccdriver_71',['tccDriver',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ab60a6e246f791951842cfd4e757dbd4d',1,'cv::cuda::DeviceInfo']]], + ['tcoords_72',['tcoords',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#ae5f1cca70c5913a8e224bc668d7f836c',1,'cv::viz::Mesh']]], + ['teal_73',['teal',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#adf605e364215330fdb1d136f47c0a6c5',1,'cv::viz::Color']]], + ['techniques_74',['Performance Measurement and Improvement Techniques',['https://docs.opencv.org/4.2.0/dc/d71/tutorial_py_optimization.html',1,'']]], + ['tegra_20with_20cuda_75',['Building OpenCV for Tegra with CUDA',['https://docs.opencv.org/4.2.0/d6/d15/tutorial_building_tegra_cuda.html',1,'']]], + ['telem_5fperiod_76',['TELEM_PERIOD',['../namespacerobot.html#a014644aaac752932a2caa9d0be8b2842',1,'robot']]], + ['telemetry_5ft_77',['telemetry_t',['../namespacecan.html#a9141a3d03d1375266eac48fb4d2fef37',1,'can']]], + ['telemreporttask_78',['TelemReportTask',['../classnet_1_1mc_1_1tasks_1_1TelemReportTask.html',1,'net::mc::tasks']]], + ['telemtype_5ft_79',['telemtype_t',['../namespacecan.html#af98139e403f1d81f1d91b55695b90ad4',1,'can']]], + ['tellg_80',['tellg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'basic_iostream< char >::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'basic_iostream< char >::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'basic_istream< char >::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'basic_istream< char >::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'basic_istream< char, _Traits >::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'basic_istream< char, _Traits >::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_fstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_fstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_ifstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_ifstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_iostream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_iostream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_istream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_istream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_istringstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_istringstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_stringstream::tellg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a46cc2065d192a9689f39d298a9573341',1,'std::basic_stringstream::tellg()']]], + ['tellp_81',['tellp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'basic_iostream< char >::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'basic_ostream< char >::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'basic_ostream< char, _Traits >::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'std::basic_fstream::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'std::basic_iostream::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'std::basic_ofstream::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'std::basic_ostream::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'std::basic_ostringstream::tellp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a57b81a67592e9a2692704ef6cb675946',1,'std::basic_stringstream::tellp()']]], + ['temp1_82',['temp1',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#aa3d064a9194c2815dbe19c056b6dc763',1,'cv::KalmanFilter']]], + ['temp2_83',['temp2',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a14866bd506668eb0ed57b3974b3a1ee7',1,'cv::KalmanFilter']]], + ['temp3_84',['temp3',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#afdbe36066a7d7f560aa02abe6be114d8',1,'cv::KalmanFilter']]], + ['temp4_85',['temp4',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a84342f2d9dec1e6389025ad229401809',1,'cv::KalmanFilter']]], + ['temp5_86',['temp5',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a846c2a6222c6e5d8b1385dfbccc83ae0',1,'cv::KalmanFilter']]], + ['temp_5fcopied_5fumat_87',['TEMP_COPIED_UMAT',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12a66488f9c447b7b12f905eda9df17bde1',1,'cv::UMatData']]], + ['temp_5fumat_88',['TEMP_UMAT',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12a242f7bf6b8e075402f141faf71e31579',1,'cv::UMatData']]], + ['tempcopiedumat_89',['tempCopiedUMat',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a858c76492f954666835719215e04129c',1,'cv::UMatData']]], + ['tempfile_90',['tempfile',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga9fcedbe6d0104d7ce012987478b060d4',1,'cv::tempfile()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga9fcedbe6d0104d7ce012987478b060d4',1,'tempfile()(Global Namespace)']]], + ['template_91',['Template',['https://docs.opencv.org/4.2.0/d2/dc7/structcv_1_1linemod_1_1Template.html',1,'cv::linemod']]], + ['template_20and_20typename_20keywords_20in_20c_92',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], + ['template_20matching_93',['Template Matching',['https://docs.opencv.org/4.2.0/de/da9/tutorial_template_matching.html',1,'Template Matching'],['https://docs.opencv.org/4.2.0/d4/dc6/tutorial_py_template_matching.html',1,'Template Matching'],['https://docs.opencv.org/4.2.0/d8/dd1/tutorial_js_template_matching.html',1,'Template Matching']]], + ['template_20parameter_20file_94',['Exporting a template parameter file',['https://docs.opencv.org/4.2.0/df/dc0/tutorial_qds_export_parameters.html',1,'']]], + ['template_5fid_95',['template_id',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a35299ee9799423ba150fc699bb0e65dd',1,'cv::linemod::Match']]], + ['template_5fmatching_2emarkdown_96',['template_matching.markdown',['https://docs.opencv.org/4.2.0/d1/dd3/template__matching_8markdown.html',1,'']]], + ['template_5fsize_97',['template_size',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a612be59c4f667a6ea372be525c736889',1,'cv::TrackerCSRT::Params']]], + ['templatematching_98',['TemplateMatching',['https://docs.opencv.org/4.2.0/d2/d58/classcv_1_1cuda_1_1TemplateMatching.html',1,'cv::cuda']]], + ['templatematchmodes_99',['TemplateMatchModes',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#ga3a7850640f1fe1f58fe91a2d7583695d',1,'cv::TemplateMatchModes'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#ga3a7850640f1fe1f58fe91a2d7583695d',1,'TemplateMatchModes(Global Namespace)']]], + ['templatepyramid_100',['TemplatePyramid',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#ae2b55fd210e65aa7947d5523f6aee722',1,'cv::linemod::Detector']]], + ['templates_20in_20eigen_101',['Expression templates in Eigen',['https://eigen.tuxfamily.org/dox/TopicEigenExpressionTemplates.html',1,'']]], + ['templatesmap_102',['TemplatesMap',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a76690bb7364a685ebcc45a3813285a4e',1,'cv::linemod::Detector']]], + ['temporary_5fbuffer_103',['temporary_buffer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09223.html',1,'__gnu_cxx::temporary_buffer< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09223.html#a984575528c7bf7f532c7ff4b16a6a09c',1,'__gnu_cxx::temporary_buffer::temporary_buffer()']]], + ['tempumat_104',['tempUMat',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#ae0fe4f5c2d26556d535bc86b02a424d1',1,'cv::UMatData']]], + ['tensor_105',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], + ['term_5fcriteria_5f_106',['term_criteria_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a7cc52deb16df4fd9e3f2bbfd8843a743',1,'cv::detail::BundleAdjusterBase']]], + ['termcrit_107',['termcrit',['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#a6858ee26d31e8537ce6a8ae33d883d4c',1,'cv::BOWKMeansTrainer']]], + ['termcriteria_108',['TermCriteria',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html',1,'cv::TermCriteria'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#ae3130f54d419687a87349da94df1226b',1,'cv::TermCriteria::TermCriteria()'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#aa6ec470a6a29edadcdd5e94e114960f6',1,'cv::TermCriteria::TermCriteria(int type, int maxCount, double epsilon)']]], + ['termcriteria_109',['termCriteria',['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#a20b20fc233b67356fc4e286ea5ec8d2f',1,'cv::TrackerMedianFlow::Params::termCriteria'],['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a0e91ee6fb4015df0a8ba29485fe0cd26',1,'cv::detail::BundleAdjusterBase::termCriteria()']]], + ['terminate_110',['terminate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#add3befe08cc677fe78f3e6f6b0c6d29b',1,'std']]], + ['terminate_5fhandler_111',['terminate_handler',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2f2f9edd9cd5d903b65cce6ccb977fdd',1,'std']]], + ['tesseract_20master_20installation_20by_20using_20git_20bash_20version_202_2014_201_20and_20cmake_20version_203_209_201_112',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['test_113',['Point Polygon Test',['https://docs.opencv.org/4.2.0/dc/d48/tutorial_point_polygon_test.html',1,'']]], + ['test_114',['test',['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html#aa9b8dc5897d2d1e981e29c936945afb6',1,'cv::datasets::Dataset::test'],['https://docs.opencv.org/4.2.0/d3/dc8/structcv_1_1detail_1_1has__custom__wrap.html#a3ab3936ed06e2c59320b9ced7b5e5db9',1,'cv::detail::has_custom_wrap::test(check< C, decltype(&GTypeTraits< C >::wrap_value)> *)'],['https://docs.opencv.org/4.2.0/d3/dc8/structcv_1_1detail_1_1has__custom__wrap.html#a02664452df328aeeec0207725f0ed14f',1,'cv::detail::has_custom_wrap::test(...)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#abb1381e9fd6c77312c8a18b2089b5e96',1,'std::bitset::test()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ad5a3a2e3dfac03daf4a39f919e28de55',1,'std::tr2::dynamic_bitset::test()']]], + ['test_5ferror_115',['TEST_ERROR',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggae5b308134f67997a42e5ca48c2713bcbad0e961149b375d9c9e00d79ac4e4f029',1,'cv::ml::TEST_ERROR'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggae5b308134f67997a42e5ca48c2713bcbad0e961149b375d9c9e00d79ac4e4f029',1,'TEST_ERROR(Global Namespace)']]], + ['test_5fpoint_116',['test_point',['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#aa2ed8d5803b1461ebd18729eb0d82061',1,'cv::detail::Timelapser']]], + ['testasyncarray_117',['testAsyncArray',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabc8622f8ea29ba276b1aba3661ceb922',1,'cv::utils::testAsyncArray()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabc8622f8ea29ba276b1aba3661ceb922',1,'testAsyncArray()(Global Namespace)']]], + ['testasyncexception_118',['testAsyncException',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gad0dffd05238563a4ea49c6a3353e528a',1,'cv::utils::testAsyncException()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gad0dffd05238563a4ea49c6a3353e528a',1,'testAsyncException()(Global Namespace)']]], + ['texid_119',['texId',['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#ad13d3a0569c7df67afdbaf6d0f9c11da',1,'cv::ogl::Texture2D']]], + ['texobj_120',['texObj',['https://docs.opencv.org/4.2.0/d2/d09/structcv_1_1cudev_1_1TexturePtr.html#a9c83170d1b47ba8c93cd1c59a91c0cd5',1,'cv::cudev::TexturePtr']]], + ['text_121',['Text',['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html',1,'cv::gapi::wip::draw::Text'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#aa3a6d154cda31c7932cd5bdb9582dea8',1,'cv::gapi::wip::draw::Text::Text()']]], + ['text_122',['text',['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#af8a222703825b9f0f4e424d0e8079e1e',1,'cv::gapi::wip::draw::FText::text'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a48a39ec4887178ad83ac058d4abf2885',1,'cv::gapi::wip::draw::Text::text']]], + ['text_20detection_123',['Scene Text Detection',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html',1,'']]], + ['text_20detection_20and_20recognition_124',['Scene Text Detection and Recognition',['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'']]], + ['text_20module_125',['Text module',['https://docs.opencv.org/4.2.0/d0/dda/tutorial_table_of_content_text.html',1,'']]], + ['text_20recognition_126',['Text Recognition',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html',1,'Scene Text Recognition'],['https://docs.opencv.org/4.2.0/db/d7b/group__datasets__tr.html',1,'Text Recognition']]], + ['text_20with_20opencv_127',['Random generator and text with OpenCV',['https://docs.opencv.org/4.2.0/df/d61/tutorial_random_generator_and_text.html',1,'']]], + ['text_2ehpp_128',['text.hpp',['https://docs.opencv.org/4.2.0/d6/db3/text_8hpp.html',1,'']]], + ['textdetector_129',['TextDetector',['https://docs.opencv.org/4.2.0/de/d25/classcv_1_1text_1_1TextDetector.html',1,'cv::text']]], + ['textdetector_2ehpp_130',['textDetector.hpp',['https://docs.opencv.org/4.2.0/d4/d26/textDetector_8hpp.html',1,'']]], + ['textdetectorcnn_131',['TextDetectorCNN',['https://docs.opencv.org/4.2.0/d1/d66/classcv_1_1text_1_1TextDetectorCNN.html',1,'cv::text']]], + ['textrurethreshold_132',['textrureThreshold',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gaaf28b006567c18b80ffc2ce1a15e10cb',1,'cv::stereo::PropagationParameters::textrureThreshold'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gaaf28b006567c18b80ffc2ce1a15e10cb',1,'textrureThreshold(Global Namespace)']]], + ['texture_133',['Texture',['https://docs.opencv.org/4.2.0/d0/dc5/structcv_1_1cudev_1_1Texture.html',1,'cv::cudev::Texture< class >'],['https://docs.opencv.org/4.2.0/db/d26/structcv_1_1face_1_1FacemarkAAM_1_1Model_1_1Texture.html',1,'cv::face::FacemarkAAM::Model::Texture'],['https://docs.opencv.org/4.2.0/d0/dc5/structcv_1_1cudev_1_1Texture.html#a7893dd705991d7dea826a5c251d82720',1,'cv::cudev::Texture::Texture()']]], + ['texture_134',['texture',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a16b20bbdb9d830145c6c079639cad0fd',1,'cv::viz::Mesh']]], + ['texture_2ehpp_135',['texture.hpp',['https://docs.opencv.org/4.2.0/d1/de0/texture_8hpp.html',1,'']]], + ['texture2d_136',['Texture2D',['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html',1,'cv::ogl::Texture2D'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a5e559b20ea593302282f98bcd1cf784d',1,'cv::ogl::Texture2D::Texture2D()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a01f15a77aed589e236041f8da8beb73a',1,'cv::ogl::Texture2D::Texture2D(int arows, int acols, Format aformat, unsigned int atexId, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a43a07435a33f245f7b2592a86e162490',1,'cv::ogl::Texture2D::Texture2D(Size asize, Format aformat, unsigned int atexId, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1d68da272ef5e37ca21cf7f7d23c9e5f',1,'cv::ogl::Texture2D::Texture2D(int arows, int acols, Format aformat, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a3c8da810e19d71c0b2151e3f46a32068',1,'cv::ogl::Texture2D::Texture2D(Size asize, Format aformat, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a58cbe6f80d2c8eb52505fad86abf1422',1,'cv::ogl::Texture2D::Texture2D(InputArray arr, bool autoRelease=false)']]], + ['texture_5fmax_5fm_137',['texture_max_m',['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#abaf5de71cfaa8e7ed5a4ce75924ec6f4',1,'cv::face::FacemarkAAM::Params']]], + ['texturealignment_138',['textureAlignment',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ac173dbbddf57044299d14fb2db2738a3',1,'cv::cuda::DeviceInfo']]], + ['textured_20object_139',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], + ['textureflattening_140',['textureFlattening',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gad55df6aa53797365fa7cc23959a54004',1,'cv::textureFlattening()'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gad55df6aa53797365fa7cc23959a54004',1,'textureFlattening()(Global Namespace)']]], + ['textureidx_141',['textureIdx',['https://docs.opencv.org/4.2.0/db/d26/structcv_1_1face_1_1FacemarkAAM_1_1Model_1_1Texture.html#a8620762e88d51ac7eccf24ae90c1a077',1,'cv::face::FacemarkAAM::Model::Texture']]], + ['texturepitchalignment_142',['texturePitchAlignment',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a3df99e6d52baa293c1a01fd544b97bf9',1,'cv::cuda::DeviceInfo']]], + ['textureptr_143',['TexturePtr',['https://docs.opencv.org/4.2.0/d2/d09/structcv_1_1cudev_1_1TexturePtr.html',1,'cv::cudev']]], + ['textures_144',['textures',['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#afd7cea8d7e84122a30e851d1f29ab3b7',1,'cv::face::FacemarkAAM::Model']]], + ['tgmath_2eh_145',['tgmath.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00017.html',1,'']]], + ['thash_146',['THash',['https://docs.opencv.org/4.2.0/da/dff/structTHash.html',1,'']]], + ['the_20array_20class_20and_20coefficient_20wise_20operations_147',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], + ['the_20assertion_20on_20unaligned_20arrays_148',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], + ['the_20basic_20image_20container_149',['Mat - The Basic Image Container',['https://docs.opencv.org/4.2.0/d6/d6d/tutorial_mat_the_basic_image_container.html',1,'']]], + ['the_20class_20hierarchy_150',['The class hierarchy',['https://eigen.tuxfamily.org/dox/TopicClassHierarchy.html',1,'']]], + ['the_20cn_20tracker_151',['Customizing the CN Tracker',['https://docs.opencv.org/4.2.0/dc/db8/tutorial_customizing_cn_tracker.html',1,'']]], + ['the_20color_20palette_152',['Trackbar as the Color Palette',['https://docs.opencv.org/4.2.0/d9/dc8/tutorial_py_trackbar.html',1,'']]], + ['the_20contrast_20and_20brightness_20of_20an_20image_153',['Changing the contrast and brightness of an image!',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'']]], + ['the_20core_20functionality_20core_20module_154',['The Core Functionality (core module)',['https://docs.opencv.org/4.2.0/de/d7a/tutorial_table_of_content_core.html',1,'']]], + ['the_20facemark_20api_155',['the Facemark API',['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'Adding a new algorithm to the Facemark API'],['https://docs.opencv.org/4.2.0/d7/dec/tutorial_facemark_usage.html',1,'Using the Facemark API']]], + ['the_20facemarkaam_156',['Using the FacemarkAAM',['https://docs.opencv.org/4.2.0/d5/dd8/tutorial_facemark_aam.html',1,'']]], + ['the_20gpu_157',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], + ['the_20hierarchical_20data_20format_20hdf_20i_20o_158',['The Hierarchical Data Format (hdf) I/O',['https://docs.opencv.org/4.2.0/d3/d00/tutorial_table_of_content_hdf.html',1,'']]], + ['the_20homography_20explained_20with_20code_159',['Basic concepts of the homography explained with code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'']]], + ['the_20human_20retina_20and_20its_20use_20for_20image_20processing_160',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], + ['the_20learning_20based_20white_20balance_20algorithm_161',['Training the learning-based white balance algorithm',['https://docs.opencv.org/4.2.0/dc/dcb/tutorial_xphoto_training_white_balance.html',1,'']]], + ['the_20map_20class_162',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], + ['the_20matrix_20class_163',['The Matrix class',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixClass.html',1,'']]], + ['the_20microsoft_20visual_20studio_164',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['the_20module_20brings_20implementations_20of_20different_20image_20hashing_20algorithms_165',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], + ['the_20opencv_20parallel_5ffor_5f_20to_20parallelize_20your_20code_166',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], + ['the_20template_20and_20typename_20keywords_20in_20c_167',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], + ['the_20visual_20studio_20debugger_168',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['theory_169',['F-transform theory',['https://docs.opencv.org/4.2.0/db/daf/tutorial_fuzzy_theory.html',1,'']]], + ['theory_2emarkdown_170',['theory.markdown',['https://docs.opencv.org/4.2.0/d5/d90/theory_8markdown.html',1,'']]], + ['therng_171',['theRNG',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga75843061d150ad6564b5447e38e57722',1,'cv::theRNG()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga75843061d150ad6564b5447e38e57722',1,'theRNG()(Global Namespace)']]], + ['thick_172',['thick',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#a34bb49c16f726d0fa9c73f3f8f07c70d',1,'cv::gapi::wip::draw::Circle::thick'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#a9e62f5ec8931b9faad1b8f4bec552a79',1,'cv::gapi::wip::draw::Line::thick'],['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#a51fb2626ae3c77cd1a5249d5348e85fa',1,'cv::gapi::wip::draw::Poly::thick'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html#a21e025f7f94ee27104934d58ff7c3288',1,'cv::gapi::wip::draw::Rect::thick'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a6af28010818ad018e85d5cc2e0c884e5',1,'cv::gapi::wip::draw::Text::thick']]], + ['thickness_173',['thickness',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a7f24a20366bf84cf682a9e7c9fed67f1',1,'cv::QtFont']]], + ['thin_5fheap_174',['thin_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12039.html',1,'__gnu_pbds::detail']]], + ['thin_5fheap_5f_2ehpp_175',['thin_heap_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01433.html',1,'']]], + ['thin_5fheap_5f_2fconstructors_5fdestructor_5ffn_5fimps_2ehpp_176',['thin_heap_/constructors_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16715.html',1,'']]], + ['thin_5fheap_5f_2fdebug_5ffn_5fimps_2ehpp_177',['thin_heap_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16787.html',1,'']]], + ['thin_5fheap_5f_2ferase_5ffn_5fimps_2ehpp_178',['thin_heap_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16850.html',1,'']]], + ['thin_5fheap_5f_2ffind_5ffn_5fimps_2ehpp_179',['thin_heap_/find_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16895.html',1,'']]], + ['thin_5fheap_5f_2finsert_5ffn_5fimps_2ehpp_180',['thin_heap_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17015.html',1,'']]], + ['thin_5fheap_5f_2fsplit_5fjoin_5ffn_5fimps_2ehpp_181',['thin_heap_/split_join_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17258.html',1,'']]], + ['thin_5fheap_5f_2ftrace_5ffn_5fimps_2ehpp_182',['thin_heap_/trace_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17303.html',1,'']]], + ['thin_5fheap_5ftag_183',['thin_heap_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11287.html',1,'__gnu_pbds']]], + ['thinning_184',['thinning',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#ga37002c6ca80c978edb6ead5d6b39740c',1,'cv::ximgproc::thinning()'],['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#ga37002c6ca80c978edb6ead5d6b39740c',1,'thinning()(Global Namespace)']]], + ['thinning_5fguohall_185',['THINNING_GUOHALL',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#aa244a73deb4e58ae70ee96afe9d2460badb2002d300bd03c5eb6da108ab9fb36c',1,'cv::ximgproc']]], + ['thinning_5fzhangsuen_186',['THINNING_ZHANGSUEN',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#aa244a73deb4e58ae70ee96afe9d2460bacbe8f65466c9d11a295d1bc7413e3404',1,'cv::ximgproc']]], + ['thinningtypes_187',['ThinningTypes',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#aa244a73deb4e58ae70ee96afe9d2460b',1,'cv::ximgproc']]], + ['thinplatesplineshapetransformer_188',['ThinPlateSplineShapeTransformer',['https://docs.opencv.org/4.2.0/dc/d18/classcv_1_1ThinPlateSplineShapeTransformer.html',1,'cv']]], + ['thousands_5fsep_189',['thousands_sep',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a46179910ed09bd0c59748b7c65ab2f03',1,'std::moneypunct::thousands_sep()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a46179910ed09bd0c59748b7c65ab2f03',1,'std::moneypunct_byname::thousands_sep()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a7d048bb8f665b15327ad467442367219',1,'std::numpunct::thousands_sep()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a7d048bb8f665b15327ad467442367219',1,'std::numpunct_byname::thousands_sep()']]], + ['thread_190',['thread',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02863.html',1,'std::thread'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00158.html',1,'(Global Namespace)']]], + ['threading_191',['Eigen and multi-threading',['https://eigen.tuxfamily.org/dox/TopicMultiThreading.html',1,'']]], + ['threadlineid_192',['threadLineId',['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1Block.html#a88b4a5964e2ff214990975284ee9bbb0',1,'cv::cudev::Block']]], + ['threads_193',['Threads',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01484.html',1,'']]], + ['thresh_194',['thresh',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#a2558a62a1e6b2ad8f47222f175348a6b',1,'cv::videostab::RansacParams::thresh'],['https://docs.opencv.org/4.2.0/df/df5/structcv_1_1cudev_1_1ThreshBinaryFunc.html#a0c87463f3cd296b6134894a64225b937',1,'cv::cudev::ThreshBinaryFunc::thresh'],['https://docs.opencv.org/4.2.0/da/d5e/structcv_1_1cudev_1_1ThreshBinaryInvFunc.html#aecca6be0c90e3acfcfe1af7ce5c9275b',1,'cv::cudev::ThreshBinaryInvFunc::thresh'],['https://docs.opencv.org/4.2.0/df/dd9/structcv_1_1cudev_1_1ThreshToZeroFunc.html#a4f2c2e2eb830f515841f1db7d1239569',1,'cv::cudev::ThreshToZeroFunc::thresh'],['https://docs.opencv.org/4.2.0/d8/d7e/structcv_1_1cudev_1_1ThreshToZeroInvFunc.html#ac41f7d2713a50c115fe9d430091c76b9',1,'cv::cudev::ThreshToZeroInvFunc::thresh'],['https://docs.opencv.org/4.2.0/d0/d44/structcv_1_1cudev_1_1ThreshTruncFunc.html#a21cc0d431f7640b3023dd874c2c4bc01',1,'cv::cudev::ThreshTruncFunc::thresh']]], + ['thresh_5fbinary_195',['THRESH_BINARY',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a147222a96556ebc1d948b372bcd7ac59',1,'cv::THRESH_BINARY'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a147222a96556ebc1d948b372bcd7ac59',1,'THRESH_BINARY(Global Namespace)']]], + ['thresh_5fbinary_5ffunc_196',['thresh_binary_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab82e591988fab29952ec0589463e9b74',1,'cv::cudev::thresh_binary_func()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab82e591988fab29952ec0589463e9b74',1,'thresh_binary_func()(Global Namespace)']]], + ['thresh_5fbinary_5finv_197',['THRESH_BINARY_INV',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a19120b1a11d8067576cc24f4d2f03754',1,'cv::THRESH_BINARY_INV'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a19120b1a11d8067576cc24f4d2f03754',1,'THRESH_BINARY_INV(Global Namespace)']]], + ['thresh_5fbinary_5finv_5ffunc_198',['thresh_binary_inv_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f7eff7288ba28c932d1d657f65a238a',1,'cv::cudev::thresh_binary_inv_func()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f7eff7288ba28c932d1d657f65a238a',1,'thresh_binary_inv_func()(Global Namespace)']]], + ['thresh_5fmask_199',['THRESH_MASK',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a8e723ef461a5349c391032aee325fe15',1,'cv::THRESH_MASK'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a8e723ef461a5349c391032aee325fe15',1,'THRESH_MASK(Global Namespace)']]], + ['thresh_5fotsu_200',['THRESH_OTSU',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a95251923e8e22f368ffa86ba8bce87ff',1,'cv::THRESH_OTSU'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a95251923e8e22f368ffa86ba8bce87ff',1,'THRESH_OTSU(Global Namespace)']]], + ['thresh_5fto_5fzero_5ffunc_201',['thresh_to_zero_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc4697ee7c3858af0a1be46b15e4d96b',1,'cv::cudev::thresh_to_zero_func()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc4697ee7c3858af0a1be46b15e4d96b',1,'thresh_to_zero_func()(Global Namespace)']]], + ['thresh_5fto_5fzero_5finv_5ffunc_202',['thresh_to_zero_inv_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0122c76ed3e9c6ae3c9029b3024d2900',1,'cv::cudev::thresh_to_zero_inv_func()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0122c76ed3e9c6ae3c9029b3024d2900',1,'thresh_to_zero_inv_func()(Global Namespace)']]], + ['thresh_5ftozero_203',['THRESH_TOZERO',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a0e50a338a4b711a8c48f06a6b105dd98',1,'cv::THRESH_TOZERO'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a0e50a338a4b711a8c48f06a6b105dd98',1,'THRESH_TOZERO(Global Namespace)']]], + ['thresh_5ftozero_5finv_204',['THRESH_TOZERO_INV',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a47518a30aae90d799035bdcf0bb39a50',1,'cv::THRESH_TOZERO_INV'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a47518a30aae90d799035bdcf0bb39a50',1,'THRESH_TOZERO_INV(Global Namespace)']]], + ['thresh_5ftriangle_205',['THRESH_TRIANGLE',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a22ffcf680811aed95be6c7f5cd809621',1,'cv::THRESH_TRIANGLE'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a22ffcf680811aed95be6c7f5cd809621',1,'THRESH_TRIANGLE(Global Namespace)']]], + ['thresh_5ftrunc_206',['THRESH_TRUNC',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576ac7e89a5e95490116e7d2082b3096b2b8',1,'cv::THRESH_TRUNC'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576ac7e89a5e95490116e7d2082b3096b2b8',1,'THRESH_TRUNC(Global Namespace)']]], + ['thresh_5ftrunc_5ffunc_207',['thresh_trunc_func',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga224099b6a69a04ee5428ba482d77241d',1,'cv::cudev::thresh_trunc_func()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga224099b6a69a04ee5428ba482d77241d',1,'thresh_trunc_func()(Global Namespace)']]], + ['threshbinary_5f_208',['threshBinary_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19e1c2dd5bf79f6ddd854479e4bc58b2',1,'cv::cudev::threshBinary_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19e1c2dd5bf79f6ddd854479e4bc58b2',1,'threshBinary_()(Global Namespace)']]], + ['threshbinaryfunc_209',['ThreshBinaryFunc',['https://docs.opencv.org/4.2.0/df/df5/structcv_1_1cudev_1_1ThreshBinaryFunc.html',1,'cv::cudev']]], + ['threshbinaryinv_5f_210',['threshBinaryInv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga780e0b40b9cc52ccf018a021fedca326',1,'cv::cudev::threshBinaryInv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga780e0b40b9cc52ccf018a021fedca326',1,'threshBinaryInv_()(Global Namespace)']]], + ['threshbinaryinvfunc_211',['ThreshBinaryInvFunc',['https://docs.opencv.org/4.2.0/da/d5e/structcv_1_1cudev_1_1ThreshBinaryInvFunc.html',1,'cv::cudev']]], + ['threshold_212',['THRESHOLD',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#aeb231abf4b24747a3e2f6ca4d99132caa8d01c1ae87944f51bfc772f7302d7b6d',1,'cv::AgastFeatureDetector::THRESHOLD'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#aadc316b5df92d9e457c9c984f1bab7eea86ae705d0195c26863b5284ffd6a1066',1,'cv::FastFeatureDetector::THRESHOLD']]], + ['threshold_213',['threshold',['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#a154e5064920beded03b54bd4e542665f',1,'cv::face::StandardCollector::threshold'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a72276adb1aa11f870f50d0bd58af014d',1,'Eigen::ColPivHouseholderQR::threshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a72276adb1aa11f870f50d0bd58af014d',1,'ColPivHouseholderQR< MatrixType >::threshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a3909f07268496c0f08f1b57331d91075',1,'Eigen::CompleteOrthogonalDecomposition::threshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#af7f6ac15ca19c2b9e45dc3eaae58c201',1,'Eigen::FullPivHouseholderQR::threshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#ad77539203694f2d85ff7d11616e5a0a5',1,'Eigen::FullPivLU::threshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a98b2ee98690358951807353812a05c69',1,'Eigen::SVDBase::threshold()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a98b2ee98690358951807353812a05c69',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::threshold()'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gae8a4a146d1ca78c626a53577199e9c57',1,'cv::threshold()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga40f1c94ae9a9456df3cad48e3cb008e1',1,'cv::cuda::threshold()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gad538f94c264624d0ea78b853d53adcb2',1,'cv::gapi::threshold(const GMat &src, const GScalar &thresh, const GScalar &maxval, int type)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga33361fa1e5bdd6201cb23ced85e7eeae',1,'cv::gapi::threshold(const GMat &src, const GScalar &maxval, int type)'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga6c9167cbfe788a52a07f6dd3ef8ca4d9',1,'cv::ximgproc::rl::threshold()'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gae8a4a146d1ca78c626a53577199e9c57',1,'threshold(InputArray src, OutputArray dst, double thresh, double maxval, int type)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gad538f94c264624d0ea78b853d53adcb2',1,'threshold(const GMat &src, const GScalar &thresh, const GScalar &maxval, int type)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga33361fa1e5bdd6201cb23ced85e7eeae',1,'threshold(const GMat &src, const GScalar &maxval, int type)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga40f1c94ae9a9456df3cad48e3cb008e1',1,'threshold(InputArray src, OutputArray dst, double thresh, double maxval, int type, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga6c9167cbfe788a52a07f6dd3ef8ca4d9',1,'threshold(InputArray src, OutputArray rlDest, double thresh, int type)(Global Namespace)']]], + ['threshold_2emarkdown_214',['threshold.markdown',['https://docs.opencv.org/4.2.0/d1/d75/threshold_8markdown.html',1,'']]], + ['threshold_5finrange_2emarkdown_215',['threshold_inRange.markdown',['https://docs.opencv.org/4.2.0/dc/dbe/threshold__inRange_8markdown.html',1,'']]], + ['thresholding_216',['Thresholding',['https://docs.opencv.org/4.2.0/d7/d4d/tutorial_py_thresholding.html',1,'Image Thresholding'],['https://docs.opencv.org/4.2.0/d7/dd0/tutorial_js_thresholding.html',1,'Image Thresholding']]], + ['thresholding_20operations_217',['Basic Thresholding Operations',['https://docs.opencv.org/4.2.0/db/d8e/tutorial_threshold.html',1,'']]], + ['thresholding_20operations_20using_20inrange_218',['Thresholding Operations using inRange',['https://docs.opencv.org/4.2.0/da/d97/tutorial_threshold_inRange.html',1,'']]], + ['thresholdoff_219',['thresholdOFF',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#af72cef13be6c98a37de23c9beb0c816f',1,'cv::bioinspired::SegmentationParameters']]], + ['thresholdon_220',['thresholdON',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#a50eb9d7781953ddd353f54f26ba89603',1,'cv::bioinspired::SegmentationParameters']]], + ['thresholdstep_221',['thresholdStep',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a7fdc3403eb1a826bebc661dd9724faf9',1,'cv::SimpleBlobDetector::Params']]], + ['thresholdtypes_222',['ThresholdTypes',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaa9e58d2860d4afa658ef70a9b1115576',1,'cv::ThresholdTypes'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaa9e58d2860d4afa658ef70a9b1115576',1,'ThresholdTypes(Global Namespace)']]], + ['threshtozero_5f_223',['threshToZero_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fa725bd94ae0675d80a186149761bd',1,'cv::cudev::threshToZero_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fa725bd94ae0675d80a186149761bd',1,'threshToZero_()(Global Namespace)']]], + ['threshtozerofunc_224',['ThreshToZeroFunc',['https://docs.opencv.org/4.2.0/df/dd9/structcv_1_1cudev_1_1ThreshToZeroFunc.html',1,'cv::cudev']]], + ['threshtozeroinv_5f_225',['threshToZeroInv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bff0fcf296b1a1007d95898a3199a5f',1,'cv::cudev::threshToZeroInv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bff0fcf296b1a1007d95898a3199a5f',1,'threshToZeroInv_()(Global Namespace)']]], + ['threshtozeroinvfunc_226',['ThreshToZeroInvFunc',['https://docs.opencv.org/4.2.0/d8/d7e/structcv_1_1cudev_1_1ThreshToZeroInvFunc.html',1,'cv::cudev']]], + ['threshtrunc_5f_227',['threshTrunc_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ec7d1dea5e7e9f7f41e45c6ae231279',1,'cv::cudev::threshTrunc_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ec7d1dea5e7e9f7f41e45c6ae231279',1,'threshTrunc_()(Global Namespace)']]], + ['threshtruncfunc_228',['ThreshTruncFunc',['https://docs.opencv.org/4.2.0/d0/d44/structcv_1_1cudev_1_1ThreshTruncFunc.html',1,'cv::cudev']]], + ['through_229',['Through',['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a7ae0bb22aa49175b46ed58010b8d5221',1,'Eigen::Hyperplane::Through(const VectorType &p0, const VectorType &p1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a23f225bb36b10ce116ca97d2ca7aa345',1,'Eigen::Hyperplane::Through(const VectorType &p0, const VectorType &p1, const VectorType &p2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a9e6c2b409eae9da4f66439fff8d4ffcc',1,'Eigen::ParametrizedLine::Through()']]], + ['throw_2ehpp_230',['throw.hpp',['https://docs.opencv.org/4.2.0/d6/dd8/throw_8hpp.html',1,'']]], + ['throw_5fallocator_2eh_231',['throw_allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01094.html',1,'']]], + ['throw_5fallocator_5fbase_232',['throw_allocator_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10739.html',1,'__gnu_cxx']]], + ['throw_5fallocator_5fbase_3c_20_5ftp_2c_20limit_5fcondition_20_3e_233',['throw_allocator_base< _Tp, limit_condition >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10739.html',1,'']]], + ['throw_5fallocator_5fbase_3c_20_5ftp_2c_20random_5fcondition_20_3e_234',['throw_allocator_base< _Tp, random_condition >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10739.html',1,'']]], + ['throw_5fallocator_5flimit_235',['throw_allocator_limit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10743.html',1,'__gnu_cxx']]], + ['throw_5fallocator_5frandom_236',['throw_allocator_random',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10751.html',1,'__gnu_cxx']]], + ['throw_5ferror_237',['throw_error',['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a40544b3ca23b3917f2a5de6b0273079d',1,'cv::util']]], + ['throw_5fvalue_5fbase_238',['throw_value_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10727.html',1,'__gnu_cxx']]], + ['throw_5fvalue_5fbase_3c_20limit_5fcondition_20_3e_239',['throw_value_base< limit_condition >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10727.html',1,'']]], + ['throw_5fvalue_5fbase_3c_20random_5fcondition_20_3e_240',['throw_value_base< random_condition >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10727.html',1,'']]], + ['throw_5fvalue_5flimit_241',['throw_value_limit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10731.html',1,'__gnu_cxx']]], + ['throw_5fvalue_5frandom_242',['throw_value_random',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10735.html',1,'__gnu_cxx']]], + ['throw_5fwith_5fnested_243',['throw_with_nested',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#gae6e361189fc8333896bebb3523551209',1,'std::throw_with_nested()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#gae6e361189fc8333896bebb3523551209',1,'throw_with_nested()(Global Namespace)']]], + ['throwonfail_244',['throwOnFail',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a8eb39d3c09569c6afe3dc9ef19253219',1,'cv::VideoCapture']]], + ['thrust_245',['Using a cv::cuda::GpuMat with thrust',['https://docs.opencv.org/4.2.0/d8/db9/tutorial_gpu_thrust_interop.html',1,'']]], + ['tickmeter_246',['TickMeter',['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html',1,'cv::TickMeter'],['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html#a3d3b77ba2aa73b05e9c79358ce44eeac',1,'cv::TickMeter::TickMeter()']]], + ['tie_247',['tie',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'basic_ios< char, _Traits >::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'basic_ios< char, _Traits >::tie(basic_ostream< char, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'basic_iostream< char >::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'basic_iostream< char >::tie(basic_ostream< char, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'basic_istream< char >::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'basic_istream< char >::tie(basic_ostream< char, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'basic_istream< char, _Traits >::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'basic_istream< char, _Traits >::tie(basic_ostream< char, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'basic_ostream< char >::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'basic_ostream< char >::tie(basic_ostream< char, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'basic_ostream< char, _Traits >::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'basic_ostream< char, _Traits >::tie(basic_ostream< char, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_fstream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_fstream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_ifstream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_ifstream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_ios::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_ios::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_iostream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_iostream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_istream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_istream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_istringstream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_istringstream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_ofstream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_ofstream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_ostream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_ostream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_ostringstream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_ostringstream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a191fdfa0d70cd77c7e396a6411d1febc',1,'std::basic_stringstream::tie() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#acb357e8950676669b63b8fc42d18bd57',1,'std::basic_stringstream::tie(basic_ostream< _CharT, _Traits > *__tiestr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga2445a380e4367c31c737e4a1f1855950',1,'std::tie()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga2445a380e4367c31c737e4a1f1855950',1,'tie()(Global Namespace)']]], + ['tile_5fdim_248',['tile_dim',['https://docs.opencv.org/4.2.0/dd/d44/structcv_1_1cudev_1_1DefaultTransposePolicy.html#aca437e2aaa4d2102c3d7299ff8e14b4da90744d11b53edcf0ae06d4352693be38',1,'cv::cudev::DefaultTransposePolicy']]], + ['tilt_5fang_249',['tilt_ang',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#a0793afa3bb857180365720f6ee9a05ae',1,'cv::datasets::FR_adienceObj']]], + ['time_250',['Time',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01475.html',1,'']]], + ['time_251',['time',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a1da7e1b7c469ed4ed45d61139cdc043d',1,'std::locale']]], + ['time_20measurement_20with_20opencv_252',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], + ['time_20pose_20estimation_20of_20a_20textured_20object_253',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], + ['time_5faffinity_5fw_254',['time_affinity_w',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a371d13dddbd4e89ced1d052931b00afe',1,'cv::tbm::TrackerParams']]], + ['time_5fbase_255',['time_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05975.html',1,'std']]], + ['time_5fget_256',['time_get',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html',1,'std::time_get< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#ad8b2b262581ad71a3ed0011c0381bd51',1,'std::time_get::time_get()']]], + ['time_5fget_5fbyname_257',['time_get_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05991.html',1,'std']]], + ['time_5fmembers_2eh_258',['time_members.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00725.html',1,'']]], + ['time_5fpoint_259',['time_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01843.html',1,'std::chrono']]], + ['time_5fpoint_3c_20_5fclock_2c_20_5fduration_20_3e_260',['time_point< _Clock, _Duration >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01843.html',1,'']]], + ['time_5fpoint_3c_20clock_20_3e_261',['time_point< Clock >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01843.html',1,'std::chrono']]], + ['time_5fpoint_3c_20dataclock_20_3e_262',['time_point< dataclock >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01843.html',1,'std::chrono']]], + ['time_5fpoint_3c_20std_3a_3achrono_3a_3ahigh_5fresolution_5fclock_20_3e_263',['time_point< std::chrono::high_resolution_clock >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01843.html',1,'std::chrono']]], + ['time_5fpoint_5fcast_264',['time_point_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#a313d932abb364aa9f2e206ad2542740a',1,'std::chrono']]], + ['time_5fput_265',['time_put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html',1,'std::time_put< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#af235ae96d55674ae060a1788fd036176',1,'std::time_put::time_put()']]], + ['time_5fput_5fbyname_266',['time_put_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05999.html',1,'std']]], + ['timed_5fmutex_267',['timed_mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02615.html',1,'std']]], + ['timelapser_268',['Timelapser',['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html',1,'cv::detail']]], + ['timelapsercrop_269',['TimelapserCrop',['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1detail_1_1TimelapserCrop.html',1,'cv::detail']]], + ['timelapsers_2ehpp_270',['timelapsers.hpp',['https://docs.opencv.org/4.2.0/d8/d46/timelapsers_8hpp.html',1,'']]], + ['timeout_271',['timeout',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html#gad3ce465ffb10e354aa30c4ce93b68beea90272dda245ae1fb3cf197e91a8689dc',1,'timeout(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4a90272dda245ae1fb3cf197e91a8689dc',1,'timeout(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html#gad3ce465ffb10e354aa30c4ce93b68beea90272dda245ae1fb3cf197e91a8689dc',1,'timeout(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4a90272dda245ae1fb3cf197e91a8689dc',1,'timeout(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html#gad3ce465ffb10e354aa30c4ce93b68beea90272dda245ae1fb3cf197e91a8689dc',1,'timeout(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4a90272dda245ae1fb3cf197e91a8689dc',1,'timeout(Global Namespace)']]], + ['timer_272',['Timer',['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html',1,'cv::ocl::Timer'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#a2f5d362d7f7af2867dd7d07becc7473c',1,'cv::ocl::Timer::Timer()']]], + ['timer_2eh_273',['timer.h',['https://docs.opencv.org/4.2.0/d5/dd0/timer_8h.html',1,'']]], + ['times_274',['times',['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html#a640c7a72e13a81482cc26238e1e86bf5',1,'cv::datasets::SLAM_kittiObj']]], + ['timestamp_275',['timestamp',['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#ab5ab17e11290808695a3b67823ef2fa2',1,'cv::tbm::TrackedObject::timestamp'],['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html#a4a20b4ec8737f5a4e3f1892e472f8fe7',1,'cv::multicalib::MultiCameraCalibration::vertex::timestamp']]], + ['tinyness_5fbefore_276',['tinyness_before',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ad43f706bb453627342a50e9891ae8027',1,'std::__numeric_limits_base::tinyness_before'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#ad43f706bb453627342a50e9891ae8027',1,'std::numeric_limits::tinyness_before']]], + ['tl_277',['tl',['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a20dadc5ad7d91a438a4418521760b287',1,'cv::Rect_']]], + ['tlb_5fsize_278',['TLB_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a5685189f3c14bde3fc8857e5217a359d',1,'__gnu_parallel::_Settings']]], + ['tld_5fgetnextdatasetframe_279',['tld_getNextDatasetFrame',['https://docs.opencv.org/4.2.0/db/d13/namespacecv_1_1tld.html#a56b32defe029145b658418171774e2ac',1,'cv::tld']]], + ['tld_5finitdataset_280',['tld_InitDataset',['https://docs.opencv.org/4.2.0/db/d13/namespacecv_1_1tld.html#a334ba88e73c9a20511418d4c71dc00c0',1,'cv::tld']]], + ['tlddataset_2ehpp_281',['tldDataset.hpp',['https://docs.opencv.org/4.2.0/d7/df7/tldDataset_8hpp.html',1,'']]], + ['tls_2ehpp_282',['tls.hpp',['https://docs.opencv.org/4.2.0/d0/d96/tls_8hpp.html',1,'']]], + ['tlsdata_283',['TLSData',['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html',1,'cv::TLSData< T >'],['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#ac945ff66d0653b82b928fa03d2e955cc',1,'cv::TLSData::TLSData()'],['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#ac945ff66d0653b82b928fa03d2e955cc',1,'TLSData< cv::instr::NodeDataTls >::TLSData()']]], + ['tlsdata_3c_20cv_3a_3ainstr_3a_3anodedatatls_20_3e_284',['TLSData< cv::instr::NodeDataTls >',['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html',1,'']]], + ['tlsdataaccumulator_285',['TLSDataAccumulator',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html',1,'cv::TLSDataAccumulator< T >'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a301bbde7e15b617b722fb344183734df',1,'cv::TLSDataAccumulator::TLSDataAccumulator()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a301bbde7e15b617b722fb344183734df',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::TLSDataAccumulator()']]], + ['tlsdataaccumulator_3c_20cv_3a_3ainstr_3a_3anodedatatls_20_3e_286',['TLSDataAccumulator< cv::instr::NodeDataTls >',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html',1,'cv::TLSDataAccumulator< cv::instr::NodeDataTls >'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html',1,'TLSDataAccumulator< cv::instr::NodeDataTls >']]], + ['tlsdatacontainer_287',['TLSDataContainer',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html',1,'cv::TLSDataContainer'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#a822517e9fa810fb1278b6745b666e670',1,'cv::TLSDataContainer::TLSDataContainer()']]], + ['tm_5fccoeff_288',['TM_CCOEFF',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695dac5babb7dfda59544e3e31ea928f8cb16',1,'cv::TM_CCOEFF'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695dac5babb7dfda59544e3e31ea928f8cb16',1,'TM_CCOEFF(Global Namespace)']]], + ['tm_5fccoeff_5fnormed_289',['TM_CCOEFF_NORMED',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695dac6677e2af5e0fae82cc5339bfaef5038',1,'cv::TM_CCOEFF_NORMED'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695dac6677e2af5e0fae82cc5339bfaef5038',1,'TM_CCOEFF_NORMED(Global Namespace)']]], + ['tm_5fccorr_290',['TM_CCORR',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695da5be00b45a4d99b5e42625b4400bfde65',1,'cv::TM_CCORR'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695da5be00b45a4d99b5e42625b4400bfde65',1,'TM_CCORR(Global Namespace)']]], + ['tm_5fccorr_5fnormed_291',['TM_CCORR_NORMED',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695daf9c3ab9296f597ea71f056399a5831da',1,'cv::TM_CCORR_NORMED'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695daf9c3ab9296f597ea71f056399a5831da',1,'TM_CCORR_NORMED(Global Namespace)']]], + ['tm_5fsqdiff_292',['TM_SQDIFF',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695dab65c042ed62c9e9e095a1e7e41fe2773',1,'cv::TM_SQDIFF'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695dab65c042ed62c9e9e095a1e7e41fe2773',1,'TM_SQDIFF(Global Namespace)']]], + ['tm_5fsqdiff_5fnormed_293',['TM_SQDIFF_NORMED',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695da5382c8f9df87e87cf1e9f9927dc3bc31',1,'cv::TM_SQDIFF_NORMED'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#gga3a7850640f1fe1f58fe91a2d7583695da5382c8f9df87e87cf1e9f9927dc3bc31',1,'TM_SQDIFF_NORMED(Global Namespace)']]], + ['to_294',['to',['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html#a7ee67c4025576238d703f2b51bdcaa51',1,'cv::detail::GraphEdge']]], + ['to_20another_295',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], + ['to_20build_20applications_20with_20opencv_20inside_20the_20microsoft_20visual_20studio_296',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['to_20enable_20halide_20backend_20for_20improve_20efficiency_297',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], + ['to_20find_20a_20known_20object_298',['Features2D + Homography to find a known object',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_feature_homography.html',1,'']]], + ['to_20find_20objects_299',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], + ['to_20functions_300',['to functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html',1,'Adaptors for pointers to functions'],['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'Passing Eigen objects by value to functions']]], + ['to_20java_20development_301',['Introduction to Java Development',['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'']]], + ['to_20members_302',['Adaptors for pointers to members',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01511.html',1,'']]], + ['to_20opencv_303',['to OpenCV',['https://docs.opencv.org/4.2.0/df/d65/tutorial_table_of_content_introduction.html',1,'Introduction to OpenCV'],['https://docs.opencv.org/4.2.0/da/df6/tutorial_py_table_of_contents_setup.html',1,'Introduction to OpenCV']]], + ['to_20opencv_20development_20with_20clojure_304',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], + ['to_20opencv_20js_305',['Introduction to OpenCV.js',['https://docs.opencv.org/4.2.0/df/df7/tutorial_js_table_of_contents_setup.html',1,'']]], + ['to_20opencv_20js_20and_20tutorials_306',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], + ['to_20opencv_20python_20tutorials_307',['Introduction to OpenCV-Python Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'']]], + ['to_20opencv_20tracker_308',['Introduction to OpenCV Tracker',['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'']]], + ['to_20our_20applications_309',['Adding a Trackbar to our applications!',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'']]], + ['to_20parallelize_20your_20code_310',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], + ['to_20principal_20component_20analysis_20pca_311',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], + ['to_20run_20deep_20networks_20in_20browser_312',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], + ['to_20run_20deep_20networks_20on_20android_20device_313',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], + ['to_20scan_20images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_314',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], + ['to_20schedule_20your_20network_20for_20halide_20backend_315',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], + ['to_20sift_20scale_20invariant_20feature_20transform_316',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], + ['to_20support_20vector_20machines_317',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], + ['to_20surf_20speeded_20up_20robust_20features_318',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], + ['to_20the_20facemark_20api_319',['Adding a new algorithm to the Facemark API',['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'']]], + ['to_20track_320',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], + ['to_20use_20background_20subtraction_20methods_321',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], + ['to_20use_20the_20opencv_20parallel_5ffor_5f_20to_20parallelize_20your_20code_322',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], + ['to_20your_20application_323',['Add a Trackbar to Your Application',['https://docs.opencv.org/4.2.0/d5/df3/tutorial_js_trackbar.html',1,'']]], + ['to_20your_20images_324',['Adding borders to your images',['https://docs.opencv.org/4.2.0/dc/da3/tutorial_copyMakeBorder.html',1,'']]], + ['to_5fbson_325',['to_bson',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa62d64781b217372225a0652047d8cf3.html#aa62d64781b217372225a0652047d8cf3',1,'nlohmann::basic_json::to_bson(const basic_json &j)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a668e4c2ad9808218a25879700f4aef2b.html#a668e4c2ad9808218a25879700f4aef2b',1,'nlohmann::basic_json::to_bson(const basic_json &j, detail::output_adapter< uint8_t > o)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9ebed178fb7dad1a574bcb7c361fb1b8.html#a9ebed178fb7dad1a574bcb7c361fb1b8',1,'nlohmann::basic_json::to_bson(const basic_json &j, detail::output_adapter< char > o)']]], + ['to_5fbytes_326',['to_bytes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a5ea01f210ea99aee4fe16eb79b5a5460',1,'std::wstring_convert::to_bytes(_Elem __wchar)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a7a955d4914f3262ae49ad762c63e54ca',1,'std::wstring_convert::to_bytes(const _Elem *__ptr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a9112609c7da47cc6ec1d285d3c3a3498',1,'std::wstring_convert::to_bytes(const wide_string &__wstr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#aa74109db15f1b0b78ac63ef3ed9693f7',1,'std::wstring_convert::to_bytes(const _Elem *__first, const _Elem *__last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a5ea01f210ea99aee4fe16eb79b5a5460',1,'std::wstring_convert::to_bytes(_Elem __wchar)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a7a955d4914f3262ae49ad762c63e54ca',1,'std::wstring_convert::to_bytes(const _Elem *__ptr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a9112609c7da47cc6ec1d285d3c3a3498',1,'std::wstring_convert::to_bytes(const wide_string &__wstr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#aa74109db15f1b0b78ac63ef3ed9693f7',1,'std::wstring_convert::to_bytes(const _Elem *__first, const _Elem *__last)']]], + ['to_5fcbor_327',['to_cbor',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_adabcf74c9c868da3e04a5546b7705af4.html#adabcf74c9c868da3e04a5546b7705af4',1,'nlohmann::basic_json::to_cbor(const basic_json &j)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a2becf604016783e5644eaa7782a08683.html#a2becf604016783e5644eaa7782a08683',1,'nlohmann::basic_json::to_cbor(const basic_json &j, detail::output_adapter< uint8_t > o)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5689672954fd3bc38f2f17e5607064c6.html#a5689672954fd3bc38f2f17e5607064c6',1,'nlohmann::basic_json::to_cbor(const basic_json &j, detail::output_adapter< char > o)']]], + ['to_5fjson_328',['to_json',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1adl__serializer_afdcc8f0204ce8ac7d28a5403f6e1f0e7.html#afdcc8f0204ce8ac7d28a5403f6e1f0e7',1,'nlohmann::adl_serializer::to_json()'],['https://nlohmann.github.io/json/doxygen/namespacenlohmann_1_1anonymous__namespace_02json_8hpp_03_a455d0daa616e67bbb74d81cf3ba15e79.html#a455d0daa616e67bbb74d81cf3ba15e79',1,'nlohmann::anonymous_namespace{json.hpp}::to_json']]], + ['to_5fmsgpack_329',['to_msgpack',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a99b15bcaee410426b937eacc6e47d771.html#a99b15bcaee410426b937eacc6e47d771',1,'nlohmann::basic_json::to_msgpack(const basic_json &j)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa8fe46eda86f6f92c5599c20b6c81819.html#aa8fe46eda86f6f92c5599c20b6c81819',1,'nlohmann::basic_json::to_msgpack(const basic_json &j, detail::output_adapter< uint8_t > o)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aca5dc0fca52131f3a634372120abfbe7.html#aca5dc0fca52131f3a634372120abfbe7',1,'nlohmann::basic_json::to_msgpack(const basic_json &j, detail::output_adapter< char > o)']]], + ['to_5focv_330',['to_ocv',['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a8364ba7dd882bebca8c10b80eb5a9ff4',1,'cv::gapi::own::to_ocv(Mat const &m)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a729faccb5070a1a90945a95de0d3ae61',1,'cv::gapi::own::to_ocv(Mat &&)=delete'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a461b3f83fa19e71d5177ec5f0f832acb',1,'cv::gapi::own::to_ocv(const Scalar &s)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ac18981b6a885b76b6002a7cfed7264f9',1,'cv::gapi::own::to_ocv(const Size &s)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#afd1a94b3ca085818f37ef321e21214d6',1,'cv::gapi::own::to_ocv(const Rect &r)']]], + ['to_5fown_331',['to_own',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a514764b0f88756f12af1bf347fdbdba3',1,'cv::to_own(const cv::MatSize &sz)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#aee7320fdbc6a7a6b6907d0cba8a3f139',1,'cv::to_own(Mat &&)=delete'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#af01116c4ec5866aa63028114b04ba933',1,'cv::to_own(Mat const &m)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a27bb8cf016b95c5593c3d7884766daf5',1,'cv::to_own(const cv::Scalar &s)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a40131c96457013d34cf0986ef0a87581',1,'cv::to_own(const Size &s)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a1abef2827298fc9fa1163b142276a41e',1,'cv::to_own(const Rect &r)']]], + ['to_5fstring_332',['to_string',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a14f4372623ade9d8dde70d1012d647e1',1,'std::bitset::to_string()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a059c2dbeb4277691875b35b2c8409080',1,'std::tr2::dynamic_bitset::to_string()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a3d4b15d32d096e3776c5d2c773b524f5.html#a3d4b15d32d096e3776c5d2c773b524f5',1,'nlohmann::json_pointer::to_string()'],['https://nlohmann.github.io/json/doxygen/namespacenlohmann_a6ce645a0b8717757e096a5b5773b7a16.html#a6ce645a0b8717757e096a5b5773b7a16',1,'nlohmann::to_string()'],['../namespaceutil.html#a38a49bcfa8ed1a20f65a28d004e7af74',1,'util::to_string(const T &val)']]], + ['to_5fstring_3c_20bool_20_3e_333',['to_string< bool >',['../namespaceutil.html#a6b20b0142e53d95a9c4831635f657cb1',1,'util::to_string< bool >(const bool &val)'],['../namespaceutil.html#a6b20b0142e53d95a9c4831635f657cb1',1,'util::to_string< bool >(const bool &val)']]], + ['to_5fubjson_334',['to_ubjson',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a25355b9719db23b189fb5f6a8f4f16c4.html#a25355b9719db23b189fb5f6a8f4f16c4',1,'nlohmann::basic_json::to_ubjson(const basic_json &j, const bool use_size=false, const bool use_type=false)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a19dad92c4fe9e6a289a93195e1230e97.html#a19dad92c4fe9e6a289a93195e1230e97',1,'nlohmann::basic_json::to_ubjson(const basic_json &j, detail::output_adapter< uint8_t > o, const bool use_size=false, const bool use_type=false)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6d133cf7b2e729e9e215edeba5726116.html#a6d133cf7b2e729e9e215edeba5726116',1,'nlohmann::basic_json::to_ubjson(const basic_json &j, detail::output_adapter< char > o, const bool use_size=false, const bool use_type=false)']]], + ['to_5fullong_335',['to_ullong',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab8d0f32ee206f1c1c54a117f6bde02f2',1,'std::tr2::dynamic_bitset']]], + ['to_5fulong_336',['to_ulong',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac43af07a3a1af8d80529ce525eb08716',1,'std::bitset::to_ulong()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a17b163f21c7fc5b28e3925627511e075',1,'std::tr2::dynamic_bitset::to_ulong()']]], + ['toaffine_337',['toAffine',['https://docs.opencv.org/4.2.0/da/d1b/classcv_1_1reg_1_1MapTypeCaster.html#a10b76cf3dcaa5ec7443a1d4c7357884f',1,'cv::reg::MapTypeCaster']]], + ['todensematrix_338',['toDenseMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#addfa91a2c2c69c76159f1091368a505f',1,'Eigen::PermutationBase::toDenseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#addfa91a2c2c69c76159f1091368a505f',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::toDenseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#addfa91a2c2c69c76159f1091368a505f',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::toDenseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#addfa91a2c2c69c76159f1091368a505f',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::toDenseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#addfa91a2c2c69c76159f1091368a505f',1,'PermutationBase< PermutationWrapper< _IndicesType > >::toDenseMatrix()']]], + ['tofilemotionwriter_339',['ToFileMotionWriter',['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html',1,'cv::videostab::ToFileMotionWriter'],['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html#a64568d256f97087b9d0add8e43028573',1,'cv::videostab::ToFileMotionWriter::ToFileMotionWriter()']]], + ['tolerance_340',['tolerance',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#acb442c19b5858d6b9be813dd7d36cc62',1,'Eigen::IterativeSolverBase']]], + ['tolower_341',['tolower',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0ebd233aadf12ec7725b961c469855cf',1,'__ctype_abstract_base< wchar_t >::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a60b8b7de0aed52f3e98e3b4103e088f8',1,'__ctype_abstract_base< wchar_t >::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0ebd233aadf12ec7725b961c469855cf',1,'std::__ctype_abstract_base::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a60b8b7de0aed52f3e98e3b4103e088f8',1,'std::__ctype_abstract_base::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0ebd233aadf12ec7725b961c469855cf',1,'std::ctype::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a60b8b7de0aed52f3e98e3b4103e088f8',1,'std::ctype::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a613ce83b223f740721454f283d168ceb',1,'std::ctype< char >::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aae3c348679b28ff02f655b1ac59d37d9',1,'std::ctype< char >::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0ebd233aadf12ec7725b961c469855cf',1,'std::ctype< wchar_t >::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a60b8b7de0aed52f3e98e3b4103e088f8',1,'std::ctype< wchar_t >::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0ebd233aadf12ec7725b961c469855cf',1,'std::ctype_byname::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a60b8b7de0aed52f3e98e3b4103e088f8',1,'std::ctype_byname::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a613ce83b223f740721454f283d168ceb',1,'std::ctype_byname< char >::tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aae3c348679b28ff02f655b1ac59d37d9',1,'std::ctype_byname< char >::tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aba2090a5dfff15a593e3fea40eebed91',1,'std::tolower()']]], + ['tolowercase_342',['toLowerCase',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga092419891901d4af43e7c4c2de84b3b2',1,'cv::toLowerCase()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga092419891901d4af43e7c4c2de84b3b2',1,'toLowerCase(const std::string &str)(Global Namespace)']]], + ['tomasi_20corner_20detector_343',['Shi-Tomasi corner detector',['https://docs.opencv.org/4.2.0/d8/dd8/tutorial_good_features_to_track.html',1,'']]], + ['tomasi_20corner_20detector_20good_20features_20to_20track_344',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], + ['tonemap_345',['Tonemap',['https://docs.opencv.org/4.2.0/d8/d5e/classcv_1_1Tonemap.html',1,'cv']]], + ['tonemap_2ehpp_346',['tonemap.hpp',['https://docs.opencv.org/4.2.0/dd/da2/tonemap_8hpp.html',1,'']]], + ['tonemapdrago_347',['TonemapDrago',['https://docs.opencv.org/4.2.0/da/d53/classcv_1_1TonemapDrago.html',1,'cv']]], + ['tonemapdurand_348',['TonemapDurand',['https://docs.opencv.org/4.2.0/d1/db3/classcv_1_1xphoto_1_1TonemapDurand.html',1,'cv::xphoto']]], + ['tonemapmantiuk_349',['TonemapMantiuk',['https://docs.opencv.org/4.2.0/de/d76/classcv_1_1TonemapMantiuk.html',1,'cv']]], + ['tonemapreinhard_350',['TonemapReinhard',['https://docs.opencv.org/4.2.0/d0/dec/classcv_1_1TonemapReinhard.html',1,'cv']]], + ['tools_351',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], + ['top_352',['top',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#adc6f199f89b9bcf05884bcfcf96e18ea',1,'stack< _StateSeqT >::top()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a9dd3184636ea0325d194346266e4e516',1,'stack< _StateSeqT >::top() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#abaedbd99739eef4ac53eefb478eb3900',1,'std::priority_queue::top()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#adc6f199f89b9bcf05884bcfcf96e18ea',1,'std::stack::top()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a9dd3184636ea0325d194346266e4e516',1,'std::stack::top() const']]], + ['top_20level_20format_353',['Top-Level Format',['../cameraconfig.html#toplevel',1,'']]], + ['topics_354',['General topics',['https://eigen.tuxfamily.org/dox/UserManual_Generalities.html',1,'']]], + ['topleft_355',['TopLeft',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a6740871e968264dc5a55248c7f67fb9f',1,'Eigen::AlignedBox']]], + ['topleft_356',['topLeft',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a324326659a263ceaa22b1c4f712ef820',1,'cv::Subdiv2D']]], + ['topleftceil_357',['TopLeftCeil',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378ab174a824f21db60fcbfe0ca1136ed6cf',1,'Eigen::AlignedBox']]], + ['topleftfloor_358',['TopLeftFloor',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a352b1a4b80151a3d8d8b63cbd113e40b',1,'Eigen::AlignedBox']]], + ['topose_359',['toPose',['../namespaceutil.html#afcec0cc3869936542227f6e663ad2892',1,'util']]], + ['topright_360',['TopRight',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378af68213ceced0d7988b2b9200225dcae6',1,'Eigen::AlignedBox']]], + ['toprightceil_361',['TopRightCeil',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a6eb2e279c813983a8bc89f62959be3bd',1,'Eigen::AlignedBox']]], + ['toprightfloor_362',['TopRightFloor',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a7cd9ba0b2da76e88e3e1b11796841383',1,'Eigen::AlignedBox']]], + ['toprojec_363',['toProjec',['https://docs.opencv.org/4.2.0/da/d1b/classcv_1_1reg_1_1MapTypeCaster.html#ab04e6671b186e23fb9347fae7f57bfde',1,'cv::reg::MapTypeCaster']]], + ['toqmatrix_364',['toQMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#adaa35139dce9e7e8e144bbdecf97f63f',1,'Eigen::Transform']]], + ['toqtransform_365',['toQTransform',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ae954e369a06472f44b72b199beb83cd2',1,'Eigen::Transform']]], + ['torotationmatrix_366',['toRotationMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#ad333c1b13aa0fa01d7fab30f18d2cd46',1,'Eigen::AngleAxis::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a8cf07ab9875baba2eecdd62ff93bfc3f',1,'Eigen::QuaternionBase::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a8cf07ab9875baba2eecdd62ff93bfc3f',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a8cf07ab9875baba2eecdd62ff93bfc3f',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a8cf07ab9875baba2eecdd62ff93bfc3f',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a961167d84c8b9a989f2ba8609a6afcaf',1,'Eigen::Rotation2D::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'Eigen::RotationBase::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'RotationBase< AngleAxis< _Scalar >, 3 >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'RotationBase< Derived, 3 >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::toRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a94fe3683c867c39d34505932b07e956a',1,'RotationBase< Rotation2D< _Scalar >, 2 >::toRotationMatrix()']]], + ['toshift_367',['toShift',['https://docs.opencv.org/4.2.0/da/d1b/classcv_1_1reg_1_1MapTypeCaster.html#aea75482cd7a3db0a0205d5e82c68d49f',1,'cv::reg::MapTypeCaster']]], + ['tostring_368',['toString',['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#af971ba08e7b65ecc2b809866b98f317b',1,'cv::dnn']]], + ['total_369',['total',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a2ccd313e06ba169ca6d45c2457d75ee5',1,'cv::_InputArray::total()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa4d317d43fb0cba9c2503f3c61b866c8',1,'cv::Mat::total() const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a5c506fc8b2cf52375e0d8be26aae0df4',1,'cv::Mat::total(int startDim, int endDim=INT_MAX) const'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a93dbce66072b6125bf87634f230f9470',1,'cv::gapi::own::Mat::total()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#abe7fd91b67cf90aa90c0845572552030',1,'cv::UMat::total()'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a65ad6cf1b64a572bf78d696d2014b0e6',1,'cv::dnn::total()']]], + ['total_5fnum_5fmatches_5f_370',['total_num_matches_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a4f14cdc846f7f03828c1fb6c21539936',1,'cv::detail::BundleAdjusterBase']]], + ['totalconstmem_371',['totalConstMem',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a29400f0d97437a3719bad4bbfda7cf4c',1,'cv::cuda::DeviceInfo']]], + ['totalglobalmem_372',['totalGlobalMem',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#aaf390495658f0b0438c1aa0bac4a2653',1,'cv::cuda::DeviceInfo']]], + ['totalmemory_373',['totalMemory',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ababe3526678da77c83e40e2e3ed00599',1,'cv::cuda::DeviceInfo']]], + ['totransform_374',['toTransform',['../namespaceutil.html#a491b92a3b8414fcfa7ea00bdc9cdcd3e',1,'util']]], + ['totransformrotatefirst_375',['toTransformRotateFirst',['../namespaceutil.html#a1d75d06aaea966512ccaad4538b79101',1,'util']]], + ['toupper_376',['toupper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a3308c7447a3a2c54ab8cb344f502baff',1,'__ctype_abstract_base< wchar_t >::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ae8000f95414789f7a5cba135b3b1e7b8',1,'__ctype_abstract_base< wchar_t >::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a3308c7447a3a2c54ab8cb344f502baff',1,'std::__ctype_abstract_base::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ae8000f95414789f7a5cba135b3b1e7b8',1,'std::__ctype_abstract_base::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a3308c7447a3a2c54ab8cb344f502baff',1,'std::ctype::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ae8000f95414789f7a5cba135b3b1e7b8',1,'std::ctype::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a40a825cf22f673eafcd52ec226982604',1,'std::ctype< char >::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a45aa4603a4e2181084e6f634d83502fc',1,'std::ctype< char >::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a3308c7447a3a2c54ab8cb344f502baff',1,'std::ctype< wchar_t >::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ae8000f95414789f7a5cba135b3b1e7b8',1,'std::ctype< wchar_t >::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a3308c7447a3a2c54ab8cb344f502baff',1,'std::ctype_byname::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ae8000f95414789f7a5cba135b3b1e7b8',1,'std::ctype_byname::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a40a825cf22f673eafcd52ec226982604',1,'std::ctype_byname< char >::toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a45aa4603a4e2181084e6f634d83502fc',1,'std::ctype_byname< char >::toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4578341d5a9a5b937351d2f976ab7180',1,'std::toupper()']]], + ['touppercase_377',['toUpperCase',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3b25b7019e6fbd24d2ef83231d03c50a',1,'cv::toUpperCase()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3b25b7019e6fbd24d2ef83231d03c50a',1,'toUpperCase(const std::string &str)(Global Namespace)']]], + ['tr1_2fccomplex_378',['tr1/ccomplex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16616.html',1,'']]], + ['tr1_2fcctype_379',['tr1/cctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16619.html',1,'']]], + ['tr1_2fcfenv_380',['tr1/cfenv',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16622.html',1,'']]], + ['tr1_2fcfloat_381',['tr1/cfloat',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16625.html',1,'']]], + ['tr1_2fcinttypes_382',['tr1/cinttypes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16631.html',1,'']]], + ['tr1_2fclimits_383',['tr1/climits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16634.html',1,'']]], + ['tr1_2fcmath_384',['tr1/cmath',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16640.html',1,'']]], + ['tr1_2fcomplex_385',['tr1/complex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16649.html',1,'']]], + ['tr1_2fcstdarg_386',['tr1/cstdarg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16718.html',1,'']]], + ['tr1_2fcstdbool_387',['tr1/cstdbool',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16721.html',1,'']]], + ['tr1_2fcstdint_388',['tr1/cstdint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16724.html',1,'']]], + ['tr1_2fcstdio_389',['tr1/cstdio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16727.html',1,'']]], + ['tr1_2fcstdlib_390',['tr1/cstdlib',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16730.html',1,'']]], + ['tr1_2fctgmath_391',['tr1/ctgmath',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16733.html',1,'']]], + ['tr1_2fctime_392',['tr1/ctime',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16736.html',1,'']]], + ['tr1_2fcwchar_393',['tr1/cwchar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16739.html',1,'']]], + ['tr1_2fcwctype_394',['tr1/cwctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16742.html',1,'']]], + ['tr2_2fratio_395',['tr2/ratio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17180.html',1,'']]], + ['tr2_2ftype_5ftraits_396',['tr2/type_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17327.html',1,'']]], + ['tr_5fchars_397',['TR_chars',['https://docs.opencv.org/4.2.0/d7/dc3/classcv_1_1datasets_1_1TR__chars.html',1,'cv::datasets']]], + ['tr_5fchars_2ehpp_398',['tr_chars.hpp',['https://docs.opencv.org/4.2.0/d0/d93/tr__chars_8hpp.html',1,'']]], + ['tr_5fcharsobj_399',['TR_charsObj',['https://docs.opencv.org/4.2.0/d8/d14/structcv_1_1datasets_1_1TR__charsObj.html',1,'cv::datasets']]], + ['tr_5ficdar_400',['TR_icdar',['https://docs.opencv.org/4.2.0/d7/dfb/classcv_1_1datasets_1_1TR__icdar.html',1,'cv::datasets']]], + ['tr_5ficdar_2ehpp_401',['tr_icdar.hpp',['https://docs.opencv.org/4.2.0/d0/d2b/tr__icdar_8hpp.html',1,'']]], + ['tr_5ficdarobj_402',['TR_icdarObj',['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1datasets_1_1TR__icdarObj.html',1,'cv::datasets']]], + ['tr_5fsvt_403',['TR_svt',['https://docs.opencv.org/4.2.0/da/dc9/classcv_1_1datasets_1_1TR__svt.html',1,'cv::datasets']]], + ['tr_5fsvt_2ehpp_404',['tr_svt.hpp',['https://docs.opencv.org/4.2.0/d7/d32/tr__svt_8hpp.html',1,'']]], + ['tr_5fsvtobj_405',['TR_svtObj',['https://docs.opencv.org/4.2.0/d3/dc5/structcv_1_1datasets_1_1TR__svtObj.html',1,'cv::datasets']]], + ['trace_406',['trace',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#aeae65b9413c8b8b7fd6829ee55558d92',1,'cv::cuda::SURF_CUDA::trace'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a544b609f65eb2bd3e368b3fc2d79479e',1,'Eigen::MatrixBase::trace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a544b609f65eb2bd3e368b3fc2d79479e',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::trace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a544b609f65eb2bd3e368b3fc2d79479e',1,'MatrixBase< Solve< Decomposition, RhsType > >::trace()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga36ad18631177b097a38198c4e83c6e2b',1,'cv::trace(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3419ac19c7dcd2be4bd552a23e147dd8',1,'cv::trace(InputArray mtx)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga36ad18631177b097a38198c4e83c6e2b',1,'trace(const Matx< _Tp, m, n > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3419ac19c7dcd2be4bd552a23e147dd8',1,'trace(InputArray mtx)(Global Namespace)']]], + ['trace_2ehpp_407',['trace.hpp',['https://docs.opencv.org/4.2.0/d4/db9/trace_8hpp.html',1,'']]], + ['trace_2eprivate_2ehpp_408',['trace.private.hpp',['https://docs.opencv.org/4.2.0/df/db6/trace_8private_8hpp.html',1,'']]], + ['track_409',['Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'Shi-Tomasi Corner Detector & Good Features to Track'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html',1,'cv::tbm::Track'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a98f7c220b57a604f4c5aad93efe64229',1,'cv::tbm::Track::Track()']]], + ['track_5falov_410',['TRACK_alov',['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html',1,'cv::datasets']]], + ['track_5falov_2ehpp_411',['track_alov.hpp',['https://docs.opencv.org/4.2.0/d7/ddc/track__alov_8hpp.html',1,'']]], + ['track_5falovobj_412',['TRACK_alovObj',['https://docs.opencv.org/4.2.0/dd/d88/structcv_1_1datasets_1_1TRACK__alovObj.html',1,'cv::datasets']]], + ['track_5fvot_413',['TRACK_vot',['https://docs.opencv.org/4.2.0/dc/d52/classcv_1_1datasets_1_1TRACK__vot.html',1,'cv::datasets']]], + ['track_5fvot_2ehpp_414',['track_vot.hpp',['https://docs.opencv.org/4.2.0/d2/dd7/track__vot_8hpp.html',1,'']]], + ['track_5fvotobj_415',['TRACK_votObj',['https://docs.opencv.org/4.2.0/d9/d36/structcv_1_1datasets_1_1TRACK__votObj.html',1,'cv::datasets']]], + ['trackbar_20as_20the_20color_20palette_416',['Trackbar as the Color Palette',['https://docs.opencv.org/4.2.0/d9/dc8/tutorial_py_trackbar.html',1,'']]], + ['trackbar_20to_20our_20applications_417',['Adding a Trackbar to our applications!',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'']]], + ['trackbar_20to_20your_20application_418',['Add a Trackbar to Your Application',['https://docs.opencv.org/4.2.0/d5/df3/tutorial_js_trackbar.html',1,'']]], + ['trackbar_2emarkdown_419',['trackbar.markdown',['https://docs.opencv.org/4.2.0/d5/ddb/trackbar_8markdown.html',1,'']]], + ['trackbarcallback_420',['TrackbarCallback',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga004b512c3d09aa53f20b050b1d01fab1',1,'cv::TrackbarCallback'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga004b512c3d09aa53f20b050b1d01fab1',1,'TrackbarCallback(Global Namespace)']]], + ['tracked_5fcv_5fmat_421',['tracked_cv_mat',['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html',1,'cv::detail::tracked_cv_mat'],['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a0e888f5713607939a67c05f152cdaf83',1,'cv::detail::tracked_cv_mat::tracked_cv_mat()']]], + ['tracked_5fcv_5fumat_422',['tracked_cv_umat',['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html',1,'cv::detail::tracked_cv_umat'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a2d3d1aba90a40aa411eea051e686df35',1,'cv::detail::tracked_cv_umat::tracked_cv_umat()']]], + ['trackeddetections_423',['trackedDetections',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a5210e61b845eda2e0c0d3ba3439ae94f',1,'cv::tbm::ITrackerByMatching']]], + ['trackedobject_424',['TrackedObject',['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html',1,'cv::DetectionBasedTracker::TrackedObject'],['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html',1,'cv::tbm::TrackedObject'],['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#a3a4e43e054437af34261cb1e6717cdf6',1,'cv::tbm::TrackedObject::TrackedObject()'],['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#a2518f3d70b697de91337223101d92209',1,'cv::tbm::TrackedObject::TrackedObject(const cv::Rect &rect, float confidence, int frame_idx, int object_id)'],['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#a5538f31afacbf3bde785b76db37f6813',1,'cv::DetectionBasedTracker::TrackedObject::TrackedObject()']]], + ['trackedobjects_425',['TrackedObjects',['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#ac9cf53102cb7b1485da7d9814dbb40e8',1,'cv::tbm']]], + ['trackedobjects_426',['trackedObjects',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#adc0f343e0a2f0515b15f3ecdb7e59069',1,'cv::DetectionBasedTracker']]], + ['tracker_427',['Tracker',['https://docs.opencv.org/4.2.0/dc/db8/tutorial_customizing_cn_tracker.html',1,'Customizing the CN Tracker'],['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'Introduction to OpenCV Tracker'],['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html',1,'cv::Tracker']]], + ['tracker_2ehpp_428',['tracker.hpp',['https://docs.opencv.org/4.2.0/df/ddd/tracker_8hpp.html',1,'']]], + ['trackeradaboostingtargetstate_429',['TrackerAdaBoostingTargetState',['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerAdaBoostingTargetState'],['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html#a20ea2d9eab4ed16c8e07e99be117f66a',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerAdaBoostingTargetState::TrackerAdaBoostingTargetState()']]], + ['trackerboosting_430',['TrackerBoosting',['https://docs.opencv.org/4.2.0/d1/d1a/classcv_1_1TrackerBoosting.html',1,'cv']]], + ['trackercsrt_431',['TrackerCSRT',['https://docs.opencv.org/4.2.0/d2/da2/classcv_1_1TrackerCSRT.html',1,'cv']]], + ['trackerfeature_432',['TrackerFeature',['https://docs.opencv.org/4.2.0/d7/da2/classcv_1_1TrackerFeature.html',1,'cv']]], + ['trackerfeaturefeature2d_433',['TrackerFeatureFeature2d',['https://docs.opencv.org/4.2.0/d3/d4c/classcv_1_1TrackerFeatureFeature2d.html',1,'cv::TrackerFeatureFeature2d'],['https://docs.opencv.org/4.2.0/d3/d4c/classcv_1_1TrackerFeatureFeature2d.html#a703af7a26bade35145058687d9c0a5f2',1,'cv::TrackerFeatureFeature2d::TrackerFeatureFeature2d()']]], + ['trackerfeaturehaar_434',['TrackerFeatureHAAR',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html',1,'cv::TrackerFeatureHAAR'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a17316b00397376d9b3ad8a19b612cc9b',1,'cv::TrackerFeatureHAAR::TrackerFeatureHAAR()']]], + ['trackerfeaturehog_435',['TrackerFeatureHOG',['https://docs.opencv.org/4.2.0/d2/da3/classcv_1_1TrackerFeatureHOG.html',1,'cv::TrackerFeatureHOG'],['https://docs.opencv.org/4.2.0/d2/da3/classcv_1_1TrackerFeatureHOG.html#a837747c102d32f97c9b4280657eb75e6',1,'cv::TrackerFeatureHOG::TrackerFeatureHOG()']]], + ['trackerfeaturelbp_436',['TrackerFeatureLBP',['https://docs.opencv.org/4.2.0/dc/d73/classcv_1_1TrackerFeatureLBP.html',1,'cv::TrackerFeatureLBP'],['https://docs.opencv.org/4.2.0/dc/d73/classcv_1_1TrackerFeatureLBP.html#a852ac4abc8b33fc7b421b6638cf029d3',1,'cv::TrackerFeatureLBP::TrackerFeatureLBP()']]], + ['trackerfeatureset_437',['TrackerFeatureSet',['https://docs.opencv.org/4.2.0/dc/da7/classcv_1_1TrackerFeatureSet.html',1,'cv::TrackerFeatureSet'],['https://docs.opencv.org/4.2.0/dc/da7/classcv_1_1TrackerFeatureSet.html#a0c37dc963ae8d7d3a98f6876f04706c5',1,'cv::TrackerFeatureSet::TrackerFeatureSet()']]], + ['trackergoturn_438',['TrackerGOTURN',['https://docs.opencv.org/4.2.0/d7/d4c/classcv_1_1TrackerGOTURN.html',1,'cv']]], + ['trackerkcf_439',['TrackerKCF',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html',1,'cv']]], + ['trackerlist_440',['trackerList',['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html#af5ee90c1a31b1277eb7eef8919359ddb',1,'cv::MultiTracker']]], + ['trackermedianflow_441',['TrackerMedianFlow',['https://docs.opencv.org/4.2.0/d7/d86/classcv_1_1TrackerMedianFlow.html',1,'cv']]], + ['trackermil_442',['TrackerMIL',['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1TrackerMIL.html',1,'cv']]], + ['trackermiltargetstate_443',['TrackerMILTargetState',['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html',1,'cv::TrackerStateEstimatorMILBoosting::TrackerMILTargetState'],['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html#a84c69f72b10ac8d276d222d1c92e6e44',1,'cv::TrackerStateEstimatorMILBoosting::TrackerMILTargetState::TrackerMILTargetState()']]], + ['trackermodel_444',['TrackerModel',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html',1,'cv::TrackerModel'],['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a1c015b807dc8e37ba2d92550363a033f',1,'cv::TrackerModel::TrackerModel()']]], + ['trackermosse_445',['TrackerMOSSE',['https://docs.opencv.org/4.2.0/d0/d02/classcv_1_1TrackerMOSSE.html',1,'cv']]], + ['trackerparams_446',['TrackerParams',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html',1,'cv::tbm::TrackerParams'],['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#aa9428b99cbfee32741e9a6ae498e38c8',1,'cv::tbm::TrackerParams::TrackerParams()']]], + ['trackers_447',['trackers',['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html#a6d69d89c30a0cfc317c1dadc6b480bab',1,'cv::MultiTracker_Alt']]], + ['trackersampler_448',['TrackerSampler',['https://docs.opencv.org/4.2.0/da/d76/classcv_1_1TrackerSampler.html',1,'cv::TrackerSampler'],['https://docs.opencv.org/4.2.0/da/d76/classcv_1_1TrackerSampler.html#aaf7aae2c4a3df9427a957d8b2d28a499',1,'cv::TrackerSampler::TrackerSampler()']]], + ['trackersampleralgorithm_449',['TrackerSamplerAlgorithm',['https://docs.opencv.org/4.2.0/dc/d75/classcv_1_1TrackerSamplerAlgorithm.html',1,'cv']]], + ['trackersamplercs_450',['TrackerSamplerCS',['https://docs.opencv.org/4.2.0/da/d3e/classcv_1_1TrackerSamplerCS.html',1,'cv::TrackerSamplerCS'],['https://docs.opencv.org/4.2.0/da/d3e/classcv_1_1TrackerSamplerCS.html#a017cb90f5a6592928ac1dcd86e7d1dfc',1,'cv::TrackerSamplerCS::TrackerSamplerCS()']]], + ['trackersamplercsc_451',['TrackerSamplerCSC',['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html',1,'cv::TrackerSamplerCSC'],['https://docs.opencv.org/4.2.0/dc/d5c/classcv_1_1TrackerSamplerCSC.html#a5cfe4dfb888d22686b8b45f944aff943',1,'cv::TrackerSamplerCSC::TrackerSamplerCSC()']]], + ['trackersamplerpf_452',['TrackerSamplerPF',['https://docs.opencv.org/4.2.0/d3/df4/classcv_1_1TrackerSamplerPF.html',1,'cv::TrackerSamplerPF'],['https://docs.opencv.org/4.2.0/d3/df4/classcv_1_1TrackerSamplerPF.html#a841af709375362b4b8811721a0e9503a',1,'cv::TrackerSamplerPF::TrackerSamplerPF()']]], + ['trackerstateestimator_453',['TrackerStateEstimator',['https://docs.opencv.org/4.2.0/d2/db9/classcv_1_1TrackerStateEstimator.html',1,'cv']]], + ['trackerstateestimatoradaboosting_454',['TrackerStateEstimatorAdaBoosting',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html',1,'cv::TrackerStateEstimatorAdaBoosting'],['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a6c43e5c3c3e906c0b79cac31e00b6b13',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerStateEstimatorAdaBoosting()']]], + ['trackerstateestimatormilboosting_455',['TrackerStateEstimatorMILBoosting',['https://docs.opencv.org/4.2.0/d9/d20/classcv_1_1TrackerStateEstimatorMILBoosting.html',1,'cv::TrackerStateEstimatorMILBoosting'],['https://docs.opencv.org/4.2.0/d9/d20/classcv_1_1TrackerStateEstimatorMILBoosting.html#a9e454fd351a8f9b8caef49b978484eea',1,'cv::TrackerStateEstimatorMILBoosting::TrackerStateEstimatorMILBoosting()']]], + ['trackerstateestimatorsvm_456',['TrackerStateEstimatorSVM',['https://docs.opencv.org/4.2.0/d3/db6/classcv_1_1TrackerStateEstimatorSVM.html',1,'cv::TrackerStateEstimatorSVM'],['https://docs.opencv.org/4.2.0/d3/db6/classcv_1_1TrackerStateEstimatorSVM.html#aea9bbd162707647655db5b5ed8332096',1,'cv::TrackerStateEstimatorSVM::TrackerStateEstimatorSVM()']]], + ['trackertargetstate_457',['TrackerTargetState',['https://docs.opencv.org/4.2.0/dd/d9d/classcv_1_1TrackerTargetState.html',1,'cv']]], + ['trackertld_458',['TrackerTLD',['https://docs.opencv.org/4.2.0/dc/d1c/classcv_1_1TrackerTLD.html',1,'cv']]], + ['tracking_459',['Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'Motion Analysis and Object Tracking'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html',1,'Object Tracking'],['https://docs.opencv.org/4.2.0/db/dc1/group__datasets__track.html',1,'Tracking']]], + ['tracking_460',['AKAZE and ORB planar tracking',['https://docs.opencv.org/4.2.0/dc/d16/tutorial_akaze_tracking.html',1,'']]], + ['tracking_20api_461',['Tracking API',['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html',1,'']]], + ['tracking_2ehpp_462',['tracking.hpp',['https://docs.opencv.org/4.2.0/d4/dc2/modules_2video_2include_2opencv2_2video_2tracking_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d89/contrib_2modules_2tracking_2include_2opencv2_2tracking_2tracking_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/df6/contrib_2modules_2tracking_2include_2opencv2_2tracking_8hpp.html',1,'(Global Namespace)']]], + ['tracking_5fby_5fmatching_2ehpp_463',['tracking_by_matching.hpp',['https://docs.opencv.org/4.2.0/d1/db4/tracking__by__matching_8hpp.html',1,'']]], + ['trackinposrad_464',['trackInPosRad',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#ae38f48d4fc1ce5f9ba0b3f75c9354dff',1,'cv::TrackerSamplerCSC::Params']]], + ['trackmaxnegnum_465',['trackMaxNegNum',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a2912ff1c644f4ec602879cedccbc8c4f',1,'cv::TrackerSamplerCSC::Params']]], + ['trackmaxposnum_466',['trackMaxPosNum',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a15e2f02065086fcdc15890d276faed0a',1,'cv::TrackerSamplerCSC::Params']]], + ['tracks_467',['tracks',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a8a7fbc87af8a1b7211828fad8b291b76',1,'cv::tbm::ITrackerByMatching']]], + ['train_468',['train',['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html#a0abc96e50f11e025838150fde8ab8595',1,'cv::datasets::Dataset::train'],['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html#a79c1d836e7168c43d85b754414047202',1,'cv::line_descriptor::BinaryDescriptorMatcher::train()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a80e9fd98de5908f5348c17696eeb1a32',1,'cv::DescriptorMatcher::train()'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#ab220b434f827962455f430a12c65c074',1,'cv::cuda::DescriptorMatcher::train()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#ac8680c2aa9649ad3f55e27761165c0d6',1,'cv::face::FaceRecognizer::train()'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a4fc9f506ff3185caa168b937c4e71080',1,'cv::FlannBasedMatcher::train()'],['https://docs.opencv.org/4.2.0/da/dfe/classcv_1_1optflow_1_1GPCForest.html#acbb90d36fd7d96b7bc60949645a3a9bf',1,'cv::optflow::GPCForest::train(GPCTrainingSamples &samples, const GPCTrainingParams params=GPCTrainingParams())'],['https://docs.opencv.org/4.2.0/da/dfe/classcv_1_1optflow_1_1GPCForest.html#a7c847534dbb3d1064bdf183bfb6c8cfa',1,'cv::optflow::GPCForest::train(const std::vector< String > &imagesFrom, const std::vector< String > &imagesTo, const std::vector< String > &gt, const GPCTrainingParams params=GPCTrainingParams())'],['https://docs.opencv.org/4.2.0/da/dfe/classcv_1_1optflow_1_1GPCForest.html#ad31b607375a4fee8cdfc38d2fe826d11',1,'cv::optflow::GPCForest::train(InputArrayOfArrays imagesFrom, InputArrayOfArrays imagesTo, InputArrayOfArrays gt, const GPCTrainingParams params=GPCTrainingParams())'],['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#a841c5d9457e3b43a55cc514698f460d6',1,'cv::optflow::GPCTree::train()'],['https://docs.opencv.org/4.2.0/d9/d5c/classcv_1_1face_1_1MACE.html#a4ab56e17bdbbe6727a7f9adc8895d25d',1,'cv::face::MACE::train()'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af96a0e04f1677a835cc25263c7db3c0c',1,'cv::ml::StatModel::train(const Ptr< TrainData > &trainData, int flags=0)'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#aeb25a75f438864fb25af182fb4b1b96f',1,'cv::ml::StatModel::train(InputArray samples, int layout, InputArray responses)'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af93a21ea5866cd305936a03742f69af8',1,'cv::ml::StatModel::train(const Ptr< TrainData > &data, int flags=0)'],['https://docs.opencv.org/4.2.0/de/d0e/classcv_1_1xobjdetect_1_1WBDetector.html#a3720fb425a2d16f6cd0625a2d8bc563e',1,'cv::xobjdetect::WBDetector::train()']]], + ['train_5ferror_469',['TRAIN_ERROR',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggae5b308134f67997a42e5ca48c2713bcbadbd34852ad37a296e9ecff30b252ec69',1,'cv::ml::TRAIN_ERROR'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggae5b308134f67997a42e5ca48c2713bcbadbd34852ad37a296e9ecff30b252ec69',1,'TRAIN_ERROR(Global Namespace)']]], + ['trainauto_470',['trainAuto',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a533d3d3f950fed3f75be0d8692eeff58',1,'cv::ml::SVM::trainAuto(const Ptr< TrainData > &data, int kFold=10, ParamGrid Cgrid=getDefaultGrid(C), ParamGrid gammaGrid=getDefaultGrid(GAMMA), ParamGrid pGrid=getDefaultGrid(P), ParamGrid nuGrid=getDefaultGrid(NU), ParamGrid coeffGrid=getDefaultGrid(COEF), ParamGrid degreeGrid=getDefaultGrid(DEGREE), bool balanced=false)=0'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a4ce36fa4ff20944f24554d8ddd1f1fbf',1,'cv::ml::SVM::trainAuto(InputArray samples, int layout, InputArray responses, int kFold=10, Ptr< ParamGrid > Cgrid=SVM::getDefaultGridPtr(SVM::C), Ptr< ParamGrid > gammaGrid=SVM::getDefaultGridPtr(SVM::GAMMA), Ptr< ParamGrid > pGrid=SVM::getDefaultGridPtr(SVM::P), Ptr< ParamGrid > nuGrid=SVM::getDefaultGridPtr(SVM::NU), Ptr< ParamGrid > coeffGrid=SVM::getDefaultGridPtr(SVM::COEF), Ptr< ParamGrid > degreeGrid=SVM::getDefaultGridPtr(SVM::DEGREE), bool balanced=false)=0']]], + ['traincascade_2emarkdown_471',['traincascade.markdown',['https://docs.opencv.org/4.2.0/d1/deb/traincascade_8markdown.html',1,'']]], + ['trainclassifier_472',['trainClassifier',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html#aa84a52ea4fcabc47d73ef06a78fd5160',1,'cv::BaseClassifier']]], + ['traindata_473',['TrainData',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html',1,'cv::ml']]], + ['traindesccollection_474',['trainDescCollection',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a6c1d27bb1cea2a46e0a5c7d297368edd',1,'cv::DescriptorMatcher']]], + ['traine_475',['trainE',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a2d02b45a574d51a72263e9c53cdc4f09',1,'cv::ml::EM']]], + ['trainem_476',['trainEM',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a5a6a7badbc0c85a8c9fa50a41bf1bcd2',1,'cv::ml::EM']]], + ['trainflags_477',['TrainFlags',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#afb51e414f22dd69f281a569145ccfad7',1,'cv::ml::ANN_MLP']]], + ['trainidx_478',['trainIdx',['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#a2320bcc822280c8a416b85f80f5a4453',1,'cv::DMatch']]], + ['training_479',['Cascade Classifier Training',['https://docs.opencv.org/4.2.0/dc/d88/tutorial_traincascade.html',1,'']]], + ['training_480',['training',['https://docs.opencv.org/4.2.0/d2/d59/tutorial_ximgproc_training.html',1,'Structured forest training'],['https://docs.opencv.org/4.2.0/dc/de0/classcv_1_1face_1_1FacemarkKazemi.html#a7a1e85e9d726ac0f7ea4ad20b8f68f09',1,'cv::face::FacemarkKazemi::training()'],['https://docs.opencv.org/4.2.0/d3/d81/classcv_1_1face_1_1FacemarkTrain.html#adde846fe7b183b963a4ef04bc7d8d98c',1,'cv::face::FacemarkTrain::training()']]], + ['training_20data_20generation_20using_20icosphere_481',['Training data generation using Icosphere',['https://docs.opencv.org/4.2.0/d6/df4/tutorial_data_generation.html',1,'']]], + ['training_20model_20analysis_482',['Training Model Analysis',['https://docs.opencv.org/4.2.0/d8/d09/tutorial_model_analysis.html',1,'']]], + ['training_20the_20learning_20based_20white_20balance_20algorithm_483',['Training the learning-based white balance algorithm',['https://docs.opencv.org/4.2.0/dc/dcb/tutorial_xphoto_training_white_balance.html',1,'']]], + ['training_2emarkdown_484',['training.markdown',['https://docs.opencv.org/4.2.0/d9/d80/training_8markdown.html',1,'']]], + ['training_5fwhite_5fbalance_2emarkdown_485',['training_white_balance.markdown',['https://docs.opencv.org/4.2.0/dc/d78/training__white__balance_8markdown.html',1,'']]], + ['trainingmethods_486',['TrainingMethods',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a012b34ee340b5d4d11b6844e12816181',1,'cv::ml::ANN_MLP']]], + ['trainm_487',['trainM',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ac21fbae3a09972de0a0a1cb4c2c434d0',1,'cv::ml::EM']]], + ['trainmodel_488',['trainModel',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#acd125802f8339b1ecb67316318a4670d',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['traitas_489',['TraitAs',['https://docs.opencv.org/4.2.0/d1/dae/namespacecv_1_1gapi_1_1ie.html#af63f38e596d0a0c4a2196532cfba3c1b',1,'cv::gapi::ie']]], + ['traits_490',['Traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01540.html',1,'']]], + ['traits_2ehpp_491',['traits.hpp',['https://docs.opencv.org/4.2.0/d9/deb/modules_2core_2include_2opencv2_2core_2traits_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d94/contrib_2modules_2cudev_2include_2opencv2_2cudev_2ptr2d_2traits_8hpp.html',1,'(Global Namespace)']]], + ['traits_5ftype_492',['traits_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2ce652e072a7f6664c71548df3e43af4',1,'basic_ios< char, _Traits >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2ce652e072a7f6664c71548df3e43af4',1,'basic_ios< char, _Traits >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'basic_streambuf< _Elem, _Tr >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'basic_streambuf< _Elem, _Tr >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'basic_streambuf< char, _Traits >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'basic_streambuf< char, _Traits >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'basic_streambuf< char, char_traits< char > >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'basic_streambuf< char, char_traits< char > >::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2ce652e072a7f6664c71548df3e43af4',1,'std::basic_ios::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2ce652e072a7f6664c71548df3e43af4',1,'std::basic_ios::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02491.html#a6b50f58dfa1c21836890bd40ec2a3300',1,'std::basic_istream::sentry::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'std::basic_streambuf::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'std::basic_streambuf::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#aba59a766c14f4ae3a89119edd0c82baa',1,'std::istreambuf_iterator::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#aba59a766c14f4ae3a89119edd0c82baa',1,'std::istreambuf_iterator::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a5074fdcc3b49fe7a05c5689d04ab1033',1,'std::ostream_iterator::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a5074fdcc3b49fe7a05c5689d04ab1033',1,'std::ostream_iterator::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#a298c8f26e6abe6243ca62e48f96e8c30',1,'std::ostreambuf_iterator::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#a298c8f26e6abe6243ca62e48f96e8c30',1,'std::ostreambuf_iterator::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'std::wbuffer_convert::traits_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab3220592ca0efc72cf87e58cdc696bd6',1,'std::wbuffer_convert::traits_type']]], + ['trajectory_493',['Trajectory',['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga390cb8877f3f95b8e2f87e6ee595dfdd',1,'cv::Trajectory'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga390cb8877f3f95b8e2f87e6ee595dfdd',1,'Trajectory(Global Namespace)']]], + ['trajectory_494',['trajectory',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a7b30af308fd4b1a49a76ae20a75435f1',1,'cv::TrackerModel']]], + ['transf_495',['transf',['https://docs.opencv.org/4.2.0/d2/d71/classcv_1_1xfeatures2d_1_1Elliptic__KeyPoint.html#a37c3b9b67b41ba9e1306ef19085c0f3a',1,'cv::xfeatures2d::Elliptic_KeyPoint']]], + ['transform_496',['Transform',['https://docs.opencv.org/4.2.0/d8/d01/tutorial_discrete_fourier_transform.html',1,'Discrete Fourier Transform'],['https://docs.opencv.org/4.2.0/de/dbc/tutorial_py_fourier_transform.html',1,'Fourier Transform'],['https://docs.opencv.org/4.2.0/dd/d02/tutorial_js_fourier_transform.html',1,'Fourier Transform'],['https://docs.opencv.org/4.2.0/d4/d70/tutorial_hough_circle.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/da/d53/tutorial_py_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d3/de5/tutorial_js_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d9/db0/tutorial_hough_lines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d6/d10/tutorial_py_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d3/de6/tutorial_js_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html',1,'Hough Transform'],['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'Introduction to SIFT (Scale-Invariant Feature Transform)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html',1,'Eigen::Transform< class, _Dim, _Mode, _Options >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a19d71151dfbbe89db15961c93726dd70',1,'Eigen::Transform::Transform()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aec37de6bc74c0769dc4e47ba759bf9ec',1,'Eigen::Transform::Transform(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a83d61d4a1bd1c502c97ad67f87d55006',1,'Eigen::Transform::Transform(const QMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a63e9a5b9cf964921c24023dd680dee6d',1,'Eigen::Transform::Transform(const QTransform &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a2c3e732625ec300ef4e4cb1e17a82d35',1,'Eigen::Transform::Transform(const Transform< OtherScalarType, Dim, Mode, Options > &other)']]], + ['transform_497',['transform',['https://docs.opencv.org/4.2.0/d3/d1d/tutorial_fuzzy_filtering.html',1,'Filtering using F-transform'],['https://docs.opencv.org/4.2.0/d3/db8/tutorial_fuzzy_inpainting.html',1,'Inpainting using F-transform'],['https://docs.opencv.org/4.2.0/df/db0/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1edge.html#ad0f9bd42b52a957f40d737b8e0f9a76b',1,'cv::multicalib::MultiCameraCalibration::edge::transform'],['https://docs.opencv.org/4.2.0/df/d29/classcv_1_1cuda_1_1LookUpTable.html#afdbcbd3047f847451892f3b18cd018de',1,'cv::cuda::LookUpTable::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#af4d286d995ec6ff200854960c15b78c8',1,'regex_traits< _CharType >::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ada536ca81b2869cfe04ccb92bc42282e',1,'std::collate::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ada536ca81b2869cfe04ccb92bc42282e',1,'std::collate_byname::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#af4d286d995ec6ff200854960c15b78c8',1,'std::regex_traits::transform()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ab078178e1abfbd078b27ade489b93303',1,'Eigen::AlignedBox::transform(const Transform< Scalar, AmbientDimAtCompileTime, Mode, Options > &transform)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#aa39225243d4aca173391c0bb24d89b46',1,'Eigen::AlignedBox::transform(const typename Transform< Scalar, AmbientDimAtCompileTime, Mode, Options >::TranslationType &translation)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ae89b4a512bfb4acbf6192b37c89d1552',1,'Eigen::Hyperplane::transform(const MatrixBase< XprType > &mat, TransformTraits traits=Affine)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ae07794d268e45fd513a17c49b9a6ec81',1,'Eigen::Hyperplane::transform(const Transform< Scalar, AmbientDimAtCompileTime, Affine, TrOptions > &t, TransformTraits traits=Affine)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a1c2a0ceacef80e76b71f56992a721e6a',1,'Eigen::ParametrizedLine::transform(const MatrixBase< XprType > &mat, TransformTraits traits=Affine)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a09d711ff37c2f421c65f398b9c7120b1',1,'Eigen::ParametrizedLine::transform(const Transform< Scalar, AmbientDimAtCompileTime, Affine, TrOptions > &t, TransformTraits traits=Affine)'],['../classrobot_1_1types_1_1DataPoint.html#a8650e0e36ef570694b8cddd666c12b9e',1,'robot::types::DataPoint::transform()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga393164aa54bb9169ce0a8cc44e08ff22',1,'cv::transform()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga393164aa54bb9169ce0a8cc44e08ff22',1,'transform()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga475f12632a75f77b41aa843dfddfe422',1,'std::transform(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _UnaryOperation __unary_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga92e41473c3907d39cbc98ab6bea346fe',1,'std::transform(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _OutputIterator __result, _BinaryOperation __binary_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga475f12632a75f77b41aa843dfddfe422',1,'transform(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _UnaryOperation __unary_op)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga92e41473c3907d39cbc98ab6bea346fe',1,'transform(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _OutputIterator __result, _BinaryOperation __binary_op)(Global Namespace)']]], + ['transform_20and_20watershed_20algorithm_498',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], + ['transform_20support_499',['transform support',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html',1,'Math with F0-transform support'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html',1,'Math with F1-transform support']]], + ['transform_20theory_500',['F-transform theory',['https://docs.opencv.org/4.2.0/db/daf/tutorial_fuzzy_theory.html',1,'']]], + ['transform_2ehpp_501',['transform.hpp',['https://docs.opencv.org/4.2.0/da/da3/modules_2core_2include_2opencv2_2core_2cuda_2transform_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/df5/contrib_2modules_2cudev_2include_2opencv2_2cudev_2grid_2transform_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d14/contrib_2modules_2cudev_2include_2opencv2_2cudev_2ptr2d_2transform_8hpp.html',1,'(Global Namespace)']]], + ['transform_5fbboxes_502',['transform_bboxes',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a0e8ce822b1e0f50026fabd6492feeaa7',1,'cv::dnn_objdetect::InferBbox']]], + ['transform_5fbboxes_5finv_503',['transform_bboxes_inv',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a43a0eefb42e9c57c5de9cb976a41e3a4',1,'cv::dnn_objdetect::InferBbox']]], + ['transform_5fminimal_5fn_504',['transform_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#aebdcc2cdd7ed5932001f979f6cd1167c',1,'__gnu_parallel::_Settings']]], + ['transform_5fprimary_505',['transform_primary',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a31b5b84c5919d3fd0658cf8c18df0160',1,'regex_traits< _CharType >::transform_primary()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a31b5b84c5919d3fd0658cf8c18df0160',1,'std::regex_traits::transform_primary()']]], + ['transformation_506',['transformation',['https://docs.opencv.org/4.2.0/db/d1f/classcv_1_1GTransformImpl_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#ad8a474251aeaec92fa67bf0fe0353e41',1,'cv::GTransformImpl< K, std::function< R(Args...)> >']]], + ['transformations_507',['Transformations',['https://docs.opencv.org/4.2.0/d4/d61/tutorial_warp_affine.html',1,'Affine Transformations'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html',1,'Geometric Image Transformations'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html',1,'Miscellaneous Image Transformations'],['https://docs.opencv.org/4.2.0/d3/dbe/tutorial_opening_closing_hats.html',1,'More Morphology Transformations'],['https://docs.opencv.org/4.2.0/d9/d61/tutorial_py_morphological_ops.html',1,'Morphological Transformations'],['https://docs.opencv.org/4.2.0/d4/d76/tutorial_js_morphological_ops.html',1,'Morphological Transformations'],['https://docs.opencv.org/4.2.0/d7/d72/tutorial_transformations.html',1,'Transformations']]], + ['transformations_508',['Space transformations',['https://eigen.tuxfamily.org/dox/group__TutorialGeometry.html',1,'']]], + ['transformations_20of_20images_509',['Transformations of Images',['https://docs.opencv.org/4.2.0/da/d6e/tutorial_py_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dd/d52/tutorial_js_geometric_transformations.html',1,'Geometric Transformations of Images']]], + ['transformations_2emarkdown_510',['transformations.markdown',['https://docs.opencv.org/4.2.0/d9/d7a/transformations_8markdown.html',1,'']]], + ['transformed_511',['transformed',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#abe249d52c411b1c9a6771d4ee379b9bf',1,'Eigen::AlignedBox']]], + ['transformfd_512',['transformFD',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#ga95f303288dac0e02ab3777b603933921',1,'cv::ximgproc::transformFD()'],['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#ga95f303288dac0e02ab3777b603933921',1,'transformFD()(Global Namespace)']]], + ['transformmat_513',['transformMat',['https://docs.opencv.org/4.2.0/d7/d56/structcv_1_1datasets_1_1SLAM__tumindoorObj.html#a22515179dba2339f274c41130e790870',1,'cv::datasets::SLAM_tumindoorObj']]], + ['transformpcpose_514',['transformPCPose',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab21c92ff881ae85b72c552e7e6e52c55',1,'cv::ppf_match_3d::transformPCPose()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab21c92ff881ae85b72c552e7e6e52c55',1,'transformPCPose()(Global Namespace)']]], + ['transformpoints_515',['transformPoints',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gab6ea2bd4162efd48f2b027d21d0b7f56',1,'cv::cuda::transformPoints()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gab6ea2bd4162efd48f2b027d21d0b7f56',1,'transformPoints()(Global Namespace)']]], + ['transformptr_516',['transformPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fa9448a29af2c0d25ecbeec292957a',1,'cv::cudev::transformPtr(const SrcPtr &src, const Op &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be7d3b72b752cf6d55f6c0b1d8e3a37',1,'cv::cudev::transformPtr(const Src1Ptr &src1, const Src2Ptr &src2, const Op &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fa9448a29af2c0d25ecbeec292957a',1,'transformPtr(const SrcPtr &src, const Op &op)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be7d3b72b752cf6d55f6c0b1d8e3a37',1,'transformPtr(const Src1Ptr &src1, const Src2Ptr &src2, const Op &op)(Global Namespace)']]], + ['transformreadings_517',['transformReadings',['../namespaceutil.html#aae9ae4acf4ddb63d9633bb398b0616ee',1,'util']]], + ['transforms_20in_20opencv_518',['Image Transforms in OpenCV',['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'']]], + ['transforms_20in_20opencv_20js_519',['Image Transforms in OpenCV.js',['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'']]], + ['transformtag_520',['TransformTag',['https://docs.opencv.org/4.2.0/d8/d13/structcv_1_1detail_1_1TransformTag.html',1,'cv::detail']]], + ['transformtimediagonalreturntype_521',['TransformTimeDiagonalReturnType',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a51af5e8d8d9d9bfec091ff8aa5b7845a',1,'Eigen::Transform']]], + ['transformtraits_522',['TransformTraits',['https://eigen.tuxfamily.org/dox/group__enums.html#gaee59a86102f150923b0cac6d4ff05107',1,'Eigen::TransformTraits'],['https://eigen.tuxfamily.org/dox/group__enums.html#gaee59a86102f150923b0cac6d4ff05107',1,'TransformTraits(Global Namespace)']]], + ['transformtraj_523',['transformTraj',['../namespaceutil.html#a56fdb65ab2da6e0935db38a4a7a403fa',1,'util']]], + ['transformtype_524',['transformType',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#ab162fed327f7753dbb439d480e493a64',1,'cv::rgbd::ICPOdometry::transformType'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a515c03a41ab16c1c2d18c587bfef91e8',1,'cv::rgbd::RgbdICPOdometry::transformType'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a7a5ca2ab4842ad8165dc232f7bba6743',1,'cv::rgbd::RgbdOdometry::transformType']]], + ['transformtypes_525',['TransformTypes',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac867e23ce513e1b12612a5a34a97b264',1,'cv::xphoto::TransformTypes'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac867e23ce513e1b12612a5a34a97b264',1,'TransformTypes(Global Namespace)']]], + ['transhelper_526',['TransHelper',['https://docs.opencv.org/4.2.0/d7/df5/structcv_1_1detail_1_1TransHelper.html',1,'cv::detail']]], + ['transhelper_3c_20k_2c_20std_3a_3atuple_3c_20args_2e_2e_2e_20_3e_2c_20r_20_3e_527',['TransHelper< K, std::tuple< Args... >, R >',['https://docs.opencv.org/4.2.0/d7/df5/structcv_1_1detail_1_1TransHelper.html',1,'']]], + ['transhelper_3c_20k_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20out_20_3e_528',['TransHelper< K, std::tuple< Ins... >, Out >',['https://docs.opencv.org/4.2.0/d5/dd6/structcv_1_1detail_1_1TransHelper_3_01K_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01Out_01_4.html',1,'cv::detail']]], + ['transientareassegmentationmodule_529',['TransientAreasSegmentationModule',['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html',1,'cv::bioinspired']]], + ['transientareassegmentationmodule_2ehpp_530',['transientareassegmentationmodule.hpp',['https://docs.opencv.org/4.2.0/d4/d4c/transientareassegmentationmodule_8hpp.html',1,'']]], + ['transition_20guide_531',['Transition guide',['https://docs.opencv.org/4.2.0/db/dfa/tutorial_transition_guide.html',1,'']]], + ['transition_5fguide_2emarkdown_532',['transition_guide.markdown',['https://docs.opencv.org/4.2.0/dd/d70/transition__guide_8markdown.html',1,'']]], + ['transition_5fp_533',['transition_p',['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a00092fab778d395ac88830ece8639485',1,'cv::text::OCRBeamSearchDecoder::transition_p'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a7f63c03387913d6c872e3c4b55007a27',1,'cv::text::OCRHMMDecoder::transition_p']]], + ['transitionmatrix_534',['transitionMatrix',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a0657173e411acbf40d2d3c6b46e03b19',1,'cv::KalmanFilter']]], + ['translate_535',['translate',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a11d9cdc588a9c08c0c1c205a872663fd',1,'cv::Affine3::translate()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a11d9cdc588a9c08c0c1c205a872663fd',1,'Affine3< float >::translate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a001a4c2c5d9b06d4cc7e9a83310255c4',1,'regex_traits< _CharType >::translate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a001a4c2c5d9b06d4cc7e9a83310255c4',1,'std::regex_traits::translate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a319e3e6338893db6986533d545a92046',1,'Eigen::AlignedBox::translate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aa28c8ebe8367243653e8fb151670b24b',1,'Eigen::Transform::translate()']]], + ['translate_5fnocase_536',['translate_nocase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#aa92edaaafe63f2333dc9d1ce9167c0f3',1,'regex_traits< _CharType >::translate_nocase()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#aa92edaaafe63f2333dc9d1ce9167c0f3',1,'std::regex_traits::translate_nocase()']]], + ['translated_537',['translated',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a3d7dad56b2c9b6e3dc360c078c639f47',1,'Eigen::AlignedBox']]], + ['translation_538',['TRANSLATION',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a25c82843207af8c3e2a133dc5c887f8dac2ff112f8f88bc6d52804e7381ac48c4',1,'cv::rgbd::Odometry']]], + ['translation_539',['Translation',['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html',1,'Eigen::Translation< class, _Dim >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a7e74484699e17444c6d660c17117bf7b',1,'Eigen::Translation::Translation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a3048c4c2cf095548454aef051af5a036',1,'Eigen::Translation::Translation(const Translation< OtherScalarType, Dim > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#aef1fd431ac3f2197a8e33ce6d4163061',1,'Eigen::Translation::Translation(const VectorType &vector)']]], + ['translation_540',['translation',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#af0df7115f87f425839a7a3f2e4e1ed17',1,'cv::Affine3::translation(const Vec3 &t)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a19e2decf4df4a6e72118f9ef6482d502',1,'cv::Affine3::translation() const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#af0df7115f87f425839a7a3f2e4e1ed17',1,'Affine3< float >::translation(const Vec3 &t)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a19e2decf4df4a6e72118f9ef6482d502',1,'Affine3< float >::translation() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aa3e4201cc8d1fd98136af66544148dc7',1,'Eigen::Transform::translation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#adf4c6d97bd3f10edfa95bb04331ec8ed',1,'Eigen::Transform::translation() const']]], + ['translationbasedlocaloutlierrejector_541',['TranslationBasedLocalOutlierRejector',['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html',1,'cv::videostab::TranslationBasedLocalOutlierRejector'],['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a52028c031cc736c093fa42975fad4884',1,'cv::videostab::TranslationBasedLocalOutlierRejector::TranslationBasedLocalOutlierRejector()']]], + ['translationpart_542',['TranslationPart',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aabeaa2d375bf1b6b1d5cb5d1904fbd06',1,'Eigen::Transform']]], + ['translationtype_543',['TranslationType',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a6b463d14d8be4c0eda2eed6e943b831f',1,'Eigen::Transform']]], + ['transpccoeff_544',['transPCCoeff',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab6d5a91876b73a024830da8405909b79',1,'cv::ppf_match_3d::transPCCoeff()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab6d5a91876b73a024830da8405909b79',1,'transPCCoeff()(Global Namespace)']]], + ['transpose_545',['Transpose',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpose.html',1,'Eigen']]], + ['transpose_546',['transpose',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ad6293cc8922e39419ca4a91e9343f51b',1,'cv::MatOp::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'Eigen::DenseBase::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'DenseBase< ArrayWrapper< ExpressionType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'DenseBase< Solve< Decomposition, RhsType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ae0959abb2cfa16c9df2e5782e721811c',1,'Eigen::HouseholderSequence::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html#ab40e9cdc4582593511e57ee896e055a2',1,'Eigen::JacobiRotation::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'Eigen::PermutationBase::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< PermutationWrapper< _IndicesType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad779637ca3e3aeff2d35e1806e59f7d9',1,'Eigen::SelfAdjointView::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a33950671584ae306fbdc1c23f010be88',1,'Eigen::SelfAdjointView::transpose() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad779637ca3e3aeff2d35e1806e59f7d9',1,'SelfAdjointView< const Derived, UpLo >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a33950671584ae306fbdc1c23f010be88',1,'SelfAdjointView< const Derived, UpLo >::transpose() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'Eigen::SolverBase::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< FullPivLU< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< HouseholderQR< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< LLT< _MatrixType, _UpLo > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< PartialPivLU< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< SVDBase< Derived > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a4ecc54d938d8d0049cb821e92c6a7d60',1,'Eigen::SparseLU::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ac9efe6f446781eb1eb6e62d4a7707fd4',1,'Eigen::TriangularView::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#aa45efa0f1d6f8c009b75a4f6fc00e063',1,'Eigen::TriangularView::transpose() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ac9efe6f446781eb1eb6e62d4a7707fd4',1,'TriangularView< const Derived, Mode >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#aa45efa0f1d6f8c009b75a4f6fc00e063',1,'TriangularView< const Derived, Mode >::transpose() const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga46630ed6c0ea6254a35f447289bd7404',1,'cv::transpose()'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga327b71c3cb811a904ccf5fba37fc29f2',1,'cv::cuda::transpose()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga46630ed6c0ea6254a35f447289bd7404',1,'transpose(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga327b71c3cb811a904ccf5fba37fc29f2',1,'transpose(InputArray src1, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], + ['transpose_2ehpp_547',['transpose.hpp',['https://docs.opencv.org/4.2.0/d3/dfa/transpose_8hpp.html',1,'']]], + ['transpose_5f_548',['transpose_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab945e9df9fdb4ad2e224d1caa8bad265',1,'cv::cudev::transpose_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab945e9df9fdb4ad2e224d1caa8bad265',1,'transpose_()(Global Namespace)']]], + ['transposebody_549',['TransposeBody',['https://docs.opencv.org/4.2.0/d2/d40/structcv_1_1cudev_1_1TransposeBody.html',1,'cv::cudev']]], + ['transposeinplace_550',['transposeInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'Eigen::DenseBase::transposeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'DenseBase< ArrayWrapper< ExpressionType > >::transposeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::transposeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'DenseBase< Solve< Decomposition, RhsType > >::transposeInPlace()']]], + ['transpositions_551',['Transpositions',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html',1,'Eigen::Transpositions< SizeAtCompileTime, MaxSizeAtCompileTime, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a415e07d885093f3f256394f59d4986f4',1,'Eigen::Transpositions::Transpositions(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#aae3eb58072f5b26f3851925eec5a006f',1,'Eigen::Transpositions::Transpositions(const TranspositionsBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a6a02dae883f9bc072de3268e1696d0ba',1,'Eigen::Transpositions::Transpositions(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a415e07d885093f3f256394f59d4986f4',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::Transpositions(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#aae3eb58072f5b26f3851925eec5a006f',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::Transpositions(const TranspositionsBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a6a02dae883f9bc072de3268e1696d0ba',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::Transpositions(Index size)']]], + ['transpositions_3c_20rowsatcompiletime_2c_20maxrowsatcompiletime_20_3e_552',['Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html',1,'']]], + ['transpositionsp_553',['transpositionsP',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a47257d3500f9f7c9a4478158d0e34941',1,'Eigen::LDLT']]], + ['transpositionsstorage_554',['TranspositionsStorage',['https://eigen.tuxfamily.org/dox/structEigen_1_1TranspositionsStorage.html',1,'Eigen']]], + ['transversemercatorprojector_555',['TransverseMercatorProjector',['https://docs.opencv.org/4.2.0/d5/df7/structcv_1_1detail_1_1TransverseMercatorProjector.html',1,'cv::detail']]], + ['transversemercatorwarper_556',['TransverseMercatorWarper',['https://docs.opencv.org/4.2.0/d4/d6b/classcv_1_1detail_1_1TransverseMercatorWarper.html',1,'cv::detail::TransverseMercatorWarper'],['https://docs.opencv.org/4.2.0/df/d33/classcv_1_1TransverseMercatorWarper.html',1,'cv::TransverseMercatorWarper'],['https://docs.opencv.org/4.2.0/d4/d6b/classcv_1_1detail_1_1TransverseMercatorWarper.html#a15da1369124f1c12a32e14edd68a897a',1,'cv::detail::TransverseMercatorWarper::TransverseMercatorWarper()']]], + ['trapezoidalvelocityprofile_557',['TrapezoidalVelocityProfile',['../classcontrol_1_1TrapezoidalVelocityProfile.html',1,'control::TrapezoidalVelocityProfile< dim >'],['../classcontrol_1_1TrapezoidalVelocityProfile.html#a1957617258addd8a7a71d86801cc893e',1,'control::TrapezoidalVelocityProfile::TrapezoidalVelocityProfile()']]], + ['trapezoidalvelocityprofile_3c_201_20_3e_558',['TrapezoidalVelocityProfile< 1 >',['../classcontrol_1_1TrapezoidalVelocityProfile.html',1,'control']]], + ['trapezoidalvelocityprofile_3c_20outputdim_20_3e_559',['TrapezoidalVelocityProfile< outputDim >',['../classcontrol_1_1TrapezoidalVelocityProfile.html',1,'control']]], + ['traps_560',['traps',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#aada3546b2e0b32ecaef18c00e2b0dcfd',1,'std::__numeric_limits_base::traps'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#aada3546b2e0b32ecaef18c00e2b0dcfd',1,'std::numeric_limits::traps']]], + ['treat_5fas_5ffloating_5fpoint_561',['treat_as_floating_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01895.html',1,'std::chrono']]], + ['tree_562',['tree',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html',1,'__gnu_pbds::tree< class, class, class, class, Node_Update, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#a5c900b3230feb9f5c59bf80995eaa2b1',1,'__gnu_pbds::tree::tree(const cmp_fn &c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#a9d2c8a45cf06ac2da54bef2ff3514468',1,'__gnu_pbds::tree::tree(It first, It last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#a75e6c7ff0c466d02e91bfe5243684109',1,'__gnu_pbds::tree::tree(It first, It last, const cmp_fn &c)']]], + ['tree_5fdepth_563',['tree_depth',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a674576adc7d5244cf93ae8d1f3aba85e',1,'cv::face::FacemarkKazemi::Params::tree_depth'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a2b2a0c3cb03dd05aaa29bd6994f8ee87',1,'cv::face::FacemarkLBF::Params::tree_depth']]], + ['tree_5fmetadata_5fhelper_564',['tree_metadata_helper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12043.html',1,'__gnu_pbds::detail']]], + ['tree_5fmetadata_5fhelper_3c_20node_5fupdate_2c_20false_20_3e_565',['tree_metadata_helper< Node_Update, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12047.html',1,'__gnu_pbds::detail']]], + ['tree_5fmetadata_5fhelper_3c_20node_5fupdate_2c_20true_20_3e_566',['tree_metadata_helper< Node_Update, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12051.html',1,'__gnu_pbds::detail']]], + ['tree_5fn_567',['tree_n',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a2369f572aaed3f61a175b29f03f42563',1,'cv::face::FacemarkLBF::Params']]], + ['tree_5fnode_5fmetadata_5fdispatch_568',['tree_node_metadata_dispatch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12055.html',1,'__gnu_pbds::detail']]], + ['tree_5forder_5fstatistics_5fnode_5fupdate_569',['tree_order_statistics_node_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html',1,'__gnu_pbds']]], + ['tree_5fpolicy_2ehpp_570',['tree_policy.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01133.html',1,'']]], + ['tree_5fpolicy_2fnode_5fmetadata_5fselector_2ehpp_571',['tree_policy/node_metadata_selector.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17114.html',1,'']]], + ['tree_5fpolicy_2forder_5fstatistics_5fimp_2ehpp_572',['tree_policy/order_statistics_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17129.html',1,'']]], + ['tree_5ftag_573',['tree_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11239.html',1,'__gnu_pbds']]], + ['tree_5ftrace_5fbase_2ehpp_574',['tree_trace_base.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01154.html',1,'']]], + ['tree_5ftraits_575',['tree_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11663.html',1,'__gnu_pbds::detail']]], + ['tree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20ov_5ftree_5ftag_2c_20_5falloc_20_3e_576',['tree_traits< Key, Mapped, Cmp_Fn, Node_Update, ov_tree_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11879.html',1,'__gnu_pbds::detail']]], + ['tree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20rb_5ftree_5ftag_2c_20_5falloc_20_3e_577',['tree_traits< Key, Mapped, Cmp_Fn, Node_Update, rb_tree_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11979.html',1,'__gnu_pbds::detail']]], + ['tree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20splay_5ftree_5ftag_2c_20_5falloc_20_3e_578',['tree_traits< Key, Mapped, Cmp_Fn, Node_Update, splay_tree_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12031.html',1,'__gnu_pbds::detail']]], + ['tree_5ftraits_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20ov_5ftree_5ftag_2c_20_5falloc_20_3e_579',['tree_traits< Key, null_type, Cmp_Fn, Node_Update, ov_tree_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11883.html',1,'__gnu_pbds::detail']]], + ['tree_5ftraits_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20rb_5ftree_5ftag_2c_20_5falloc_20_3e_580',['tree_traits< Key, null_type, Cmp_Fn, Node_Update, rb_tree_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11983.html',1,'__gnu_pbds::detail']]], + ['tree_5ftraits_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20splay_5ftree_5ftag_2c_20_5falloc_20_3e_581',['tree_traits< Key, null_type, Cmp_Fn, Node_Update, splay_tree_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12035.html',1,'__gnu_pbds::detail']]], + ['trg_5fid_582',['trg_id',['https://docs.opencv.org/4.2.0/de/d39/structcv_1_1gapi_1_1plaidml_1_1config.html#a7be03e252b22c2ac83a03bac8c7f1dd4',1,'cv::gapi::plaidml::config']]], + ['triangle_583',['triangle',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a26c349619f95531945f6c0c7a24dedea',1,'cv::datasets::triangle'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a26c349619f95531945f6c0c7a24dedea',1,'triangle(Global Namespace)']]], + ['triangle_5ffan_584',['TRIANGLE_FAN',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba1778386fd1796017cf36965339b27cf7',1,'cv::ogl::TRIANGLE_FAN'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba1778386fd1796017cf36965339b27cf7',1,'TRIANGLE_FAN(Global Namespace)']]], + ['triangle_5fstrip_585',['TRIANGLE_STRIP',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabae656afaa0987fa2f044e3fdc260aa140',1,'cv::ogl::TRIANGLE_STRIP'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabae656afaa0987fa2f044e3fdc260aa140',1,'TRIANGLE_STRIP(Global Namespace)']]], + ['triangles_586',['TRIANGLES',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabab2fc9178ebe34e531f1451751e673c7d',1,'cv::ogl::TRIANGLES'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabab2fc9178ebe34e531f1451751e673c7d',1,'TRIANGLES(Global Namespace)']]], + ['triangles_587',['triangles',['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#a026fc525e61c2e0a72fc738ccc947601',1,'cv::face::FacemarkAAM::Model']]], + ['triangularbase_588',['TriangularBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html',1,'Eigen']]], + ['triangularbase_3c_20selfadjointview_3c_20_5fmatrixtype_2c_20uplo_20_3e_20_3e_589',['TriangularBase< SelfAdjointView< _MatrixType, UpLo > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html',1,'']]], + ['triangularbase_3c_20selfadjointview_3c_20const_20derived_2c_20uplo_20_3e_20_3e_590',['TriangularBase< SelfAdjointView< const Derived, UpLo > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html',1,'']]], + ['triangularbase_3c_20triangularview_3c_20_5fmatrixtype_2c_20_5fmode_20_3e_20_3e_591',['TriangularBase< TriangularView< _MatrixType, _Mode > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html',1,'']]], + ['triangularview_592',['TriangularView',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html',1,'Eigen']]], + ['triangularview_593',['triangularView',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a56665aa894f49f2765291fee0eaeb9c6',1,'Eigen::MatrixBase::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aa044521145e74117ad1df42460d7b520',1,'Eigen::MatrixBase::triangularView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a56665aa894f49f2765291fee0eaeb9c6',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aa044521145e74117ad1df42460d7b520',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::triangularView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a56665aa894f49f2765291fee0eaeb9c6',1,'MatrixBase< Solve< Decomposition, RhsType > >::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aa044521145e74117ad1df42460d7b520',1,'MatrixBase< Solve< Decomposition, RhsType > >::triangularView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#aacba330c3a12d1cac75c2f9df8c0f347',1,'Eigen::SelfAdjointView::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#aacba330c3a12d1cac75c2f9df8c0f347',1,'SelfAdjointView< const Derived, UpLo >::triangularView()']]], + ['triangularview_3c_20const_20derived_2c_20mode_20_3e_594',['TriangularView< const Derived, Mode >',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html',1,'']]], + ['triangularviewimpl_3c_20_5fmatrixtype_2c_20_5fmode_2c_20dense_20_3e_595',['TriangularViewImpl< _MatrixType, _Mode, Dense >',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html',1,'Eigen']]], + ['triangularviewimpl_3c_20matrixtype_2c_20mode_2c_20sparse_20_3e_596',['TriangularViewImpl< MatrixType, Mode, Sparse >',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01MatrixType_00_01Mode_00_01Sparse_01_4.html',1,'Eigen']]], + ['triangulatepoints_597',['triangulatePoints',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad3fc9a0c82b08df034234979960b778c',1,'cv::triangulatePoints()'],['https://docs.opencv.org/4.2.0/d0/dbd/group__triangulation.html#ga211c855276b3084f3bbd8b2d9161dc74',1,'cv::sfm::triangulatePoints()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad3fc9a0c82b08df034234979960b778c',1,'triangulatePoints(InputArray projMatr1, InputArray projMatr2, InputArray projPoints1, InputArray projPoints2, OutputArray points4D)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/dbd/group__triangulation.html#ga211c855276b3084f3bbd8b2d9161dc74',1,'triangulatePoints(InputArrayOfArrays points2d, InputArrayOfArrays projection_matrices, OutputArray points3d)(Global Namespace)']]], + ['triangulation_598',['Triangulation',['https://docs.opencv.org/4.2.0/d0/dbd/group__triangulation.html',1,'']]], + ['triangulation_2ehpp_599',['triangulation.hpp',['https://docs.opencv.org/4.2.0/da/de8/triangulation_8hpp.html',1,'']]], + ['tridiagonalization_600',['Tridiagonalization',['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html',1,'Eigen::Tridiagonalization< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a05406b7df9a92fdcba72d31443f67a98',1,'Eigen::Tridiagonalization::Tridiagonalization(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a9ea2e6154bf35494ee68e037f0867cbd',1,'Eigen::Tridiagonalization::Tridiagonalization(Index size=Size==Dynamic ? 2 :Size)']]], + ['trie_601',['trie',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html',1,'__gnu_pbds::trie< class, class, class, class, Node_Update, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html#a5feddcc5a253f6fc4ff4567ad0359b6d',1,'__gnu_pbds::trie::trie(const access_traits &t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html#a0aaac7de1516a27993552064782cdec2',1,'__gnu_pbds::trie::trie(It first, It last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html#a0f9b513af82c2a51ba44849a2155096d',1,'__gnu_pbds::trie::trie(It first, It last, const access_traits &t)']]], + ['trie_5fmetadata_5fhelper_602',['trie_metadata_helper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12063.html',1,'__gnu_pbds::detail']]], + ['trie_5fmetadata_5fhelper_3c_20node_5fupdate_2c_20false_20_3e_603',['trie_metadata_helper< Node_Update, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12067.html',1,'__gnu_pbds::detail']]], + ['trie_5fmetadata_5fhelper_3c_20node_5fupdate_2c_20true_20_3e_604',['trie_metadata_helper< Node_Update, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12071.html',1,'__gnu_pbds::detail']]], + ['trie_5fnode_5fmetadata_5fdispatch_605',['trie_node_metadata_dispatch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12075.html',1,'__gnu_pbds::detail']]], + ['trie_5forder_5fstatistics_5fnode_5fupdate_606',['trie_order_statistics_node_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html',1,'__gnu_pbds']]], + ['trie_5fpolicy_2ehpp_607',['trie_policy.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01136.html',1,'']]], + ['trie_5fpolicy_2fnode_5fmetadata_5fselector_2ehpp_608',['trie_policy/node_metadata_selector.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17117.html',1,'']]], + ['trie_5fpolicy_2forder_5fstatistics_5fimp_2ehpp_609',['trie_policy/order_statistics_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17132.html',1,'']]], + ['trie_5fpolicy_5fbase_610',['trie_policy_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12087.html',1,'__gnu_pbds::detail']]], + ['trie_5fpolicy_5fbase_2ehpp_611',['trie_policy_base.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01454.html',1,'']]], + ['trie_5fprefix_5fsearch_5fnode_5fupdate_612',['trie_prefix_search_node_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html',1,'__gnu_pbds']]], + ['trie_5fstring_5faccess_5ftraits_613',['trie_string_access_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11363.html',1,'__gnu_pbds']]], + ['trie_5fstring_5faccess_5ftraits_5fimp_2ehpp_614',['trie_string_access_traits_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01457.html',1,'']]], + ['trie_5ftag_615',['trie_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11255.html',1,'__gnu_pbds']]], + ['trie_5ftraits_616',['trie_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11667.html',1,'__gnu_pbds::detail']]], + ['trie_5ftraits_3c_20key_2c_20mapped_2c_20_5fatraits_2c_20node_5fupdate_2c_20pat_5ftrie_5ftag_2c_20_5falloc_20_3e_617',['trie_traits< Key, Mapped, _ATraits, Node_Update, pat_trie_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11959.html',1,'__gnu_pbds::detail']]], + ['trie_5ftraits_3c_20key_2c_20null_5ftype_2c_20_5fatraits_2c_20node_5fupdate_2c_20pat_5ftrie_5ftag_2c_20_5falloc_20_3e_618',['trie_traits< Key, null_type, _ATraits, Node_Update, pat_trie_tag, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11963.html',1,'__gnu_pbds::detail']]], + ['trimratio_619',['trimRatio',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#ab78d50ac661348fce0fd26c247bb85c6',1,'cv::videostab::LpMotionStabilizer::trimRatio()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#afc3dbde54f82fac976999469e049a3db',1,'cv::videostab::StabilizerBase::trimRatio() const']]], + ['trimratio_5f_620',['trimRatio_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#acd5ad58425a94dd6af0a29b98ee5517c',1,'cv::videostab::StabilizerBase']]], + ['triplet_621',['Triplet',['https://eigen.tuxfamily.org/dox/classEigen_1_1Triplet.html',1,'Eigen']]], + ['trivial_5fiterator_5fdifference_5ftype_622',['trivial_iterator_difference_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01537.html#ga3a45dab56a44f762c97eb0eaee17f6f2',1,'__gnu_pbds::trivial_iterator_difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01537.html#ga3a45dab56a44f762c97eb0eaee17f6f2',1,'trivial_iterator_difference_type(Global Namespace)']]], + ['trivial_5fiterator_5ftag_623',['trivial_iterator_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11191.html',1,'__gnu_pbds']]], + ['true_5ftype_624',['true_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga6a860513044e23d34e553ea986e83fa1',1,'std::true_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga6a860513044e23d34e553ea986e83fa1',1,'true_type(Global Namespace)']]], + ['truename_625',['truename',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a226b1f5216eec8172bf4b71bede27a74',1,'std::numpunct::truename()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a226b1f5216eec8172bf4b71bede27a74',1,'std::numpunct_byname::truename()']]], + ['trunc_626',['trunc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_ios< char, _Traits >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_iostream< char >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_istream< char >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_istream< char, _Traits >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_ostream< char >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_ostream< char, _Traits >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_fstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ifstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ios::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_iostream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_istream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_istringstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ofstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ostream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ostringstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_stringstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::ios_base::trunc']]], + ['truncated_627',['truncated',['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#a19f8baa131256e8532657f6a3265d5bb',1,'cv::datasets::PascalObj']]], + ['truncatethreshold_628',['truncateThreshold',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a7a4ff0e74b36ecb1e4be57ff1865ae56',1,'cv::dynafu::Params::truncateThreshold'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#ae813e8429d58751cf4deb56ae7362ee4',1,'cv::kinfu::Params::truncateThreshold']]], + ['try_5flock_629',['try_lock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab431f6ac9476a921df98db8862be201a',1,'std']]], + ['try_5fpull_630',['try_pull',['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#af4a40c09634ba45686b2177f38c49022',1,'cv::GStreamingCompiled']]], + ['try_5fto_5flock_631',['try_to_lock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga05e641e1ecba98edb6fa4714a6c03e0d',1,'std::try_to_lock'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga05e641e1ecba98edb6fa4714a6c03e0d',1,'try_to_lock(Global Namespace)']]], + ['try_5fto_5flock_5ft_632',['try_to_lock_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07199.html',1,'std']]], + ['tryattach_633',['tryAttach',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#afd329d7dfd4e38239bef14ecee9977cb',1,'cv::dnn::Layer']]], + ['tryfuse_634',['tryFuse',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#ae52d400e21d50885742aed859ce732ba',1,'cv::dnn::Layer']]], + ['tryinitcontroller_635',['tryInitController',['../classcontrol_1_1PlanarArmController.html#a70e57f603057bcf79cf4524315be38c0',1,'control::PlanarArmController']]], + ['ts_636',['Filesystem TS',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html',1,'']]], + ['tsdf_5fmax_5fweight_637',['tsdf_max_weight',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a74d018302877a5d279f203982219c4a7',1,'cv::dynafu::Params::tsdf_max_weight'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a9753dcad7d91c98985b606cf4b5a90b1',1,'cv::kinfu::Params::tsdf_max_weight']]], + ['tsdf_5fmin_5fcamera_5fmovement_638',['tsdf_min_camera_movement',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a8dea18215b11c8c469951f86bcb9fe48',1,'cv::dynafu::Params::tsdf_min_camera_movement'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a07a71c122207f4ecf95f42a83d6dbc48',1,'cv::kinfu::Params::tsdf_min_camera_movement']]], + ['tsdf_5ftrunc_5fdist_639',['tsdf_trunc_dist',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#abdfef009310c1cab3935e3210b6fc87f',1,'cv::dynafu::Params::tsdf_trunc_dist'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a16ea51cf7e543a0be9dfd7d320303627',1,'cv::kinfu::Params::tsdf_trunc_dist']]], + ['tt_640',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], + ['tt_20clang_20format_20tt_641',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], + ['tuple_642',['tuple',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'std::tuple< _Elements >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00161.html',1,'(Global Namespace)']]], + ['tuple_2ehpp_643',['tuple.hpp',['https://docs.opencv.org/4.2.0/d3/d6f/tuple_8hpp.html',1,'']]], + ['tuple_3c_20_5fbound_5fargs_2e_2e_2e_20_3e_644',['tuple< _Bound_args... >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], + ['tuple_3c_20_5fforwarditerator1_2c_20_5fforwarditerator1_2c_20_5fbinarypredicate_20_3e_645',['tuple< _ForwardIterator1, _ForwardIterator1, _BinaryPredicate >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], + ['tuple_3c_20_5ft1_2c_20_5ft2_20_3e_646',['tuple< _T1, _T2 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02947.html',1,'std']]], + ['tuple_3c_20pointer_2c_20_5fdp_20_3e_647',['tuple< pointer, _Dp >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], + ['tuple_3c_20pointer_2c_20default_5fdelete_3c_20_5fcodecvt_20_3e_20_3e_648',['tuple< pointer, default_delete< _Codecvt > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], + ['tuple_3c_20pointer_2c_20default_5fdelete_3c_20_5fres_5ftype_20_3e_20_3e_649',['tuple< pointer, default_delete< _Res_type > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], + ['tuple_3c_20pointer_2c_20default_5fdelete_3c_20_5fresult_3c_20_5fres_20_3e_20_3e_20_3e_650',['tuple< pointer, default_delete< _Result< _Res > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], + ['tuple_3c_20pointer_2c_20default_5fdelete_3c_20_5fresult_5fbase_20_3e_20_3e_651',['tuple< pointer, default_delete< _Result_base > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], + ['tuple_3c_20pointer_2c_20default_5fdelete_3c_20bool_20_3e_20_3e_652',['tuple< pointer, default_delete< bool > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], + ['tuple_3c_20std_3a_3aarray_3c_20_5ftp_2c_20_5flen_20_3e_2c_20_5fpred_20_3e_653',['tuple< std::array< _Tp, _Len >, _Pred >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02895.html',1,'']]], + ['tuple_5fadapter_2ehpp_654',['tuple_adapter.hpp',['https://docs.opencv.org/4.2.0/de/dd7/tuple__adapter_8hpp.html',1,'']]], + ['tuple_5fcat_655',['tuple_cat',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga23a2e3e40fefd39ffe278df7ebbd52a0',1,'std::tuple_cat()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga23a2e3e40fefd39ffe278df7ebbd52a0',1,'tuple_cat()(Global Namespace)']]], + ['tuple_5felement_656',['tuple_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01715.html',1,'std']]], + ['tuple_5felement_3c_200_2c_20std_3a_3apair_3c_20_5ftp1_2c_20_5ftp2_20_3e_20_3e_657',['tuple_element< 0, std::pair< _Tp1, _Tp2 > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04579.html',1,'std']]], + ['tuple_5felement_3c_200_2c_20tuple_3c_20_5fhead_2c_20_5ftail_2e_2e_2e_20_3e_20_3e_658',['tuple_element< 0, tuple< _Head, _Tail... > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02959.html',1,'std']]], + ['tuple_5felement_3c_201_2c_20std_3a_3apair_3c_20_5ftp1_2c_20_5ftp2_20_3e_20_3e_659',['tuple_element< 1, std::pair< _Tp1, _Tp2 > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04583.html',1,'std']]], + ['tuple_5felement_3c_20_5f_5fi_20_2d_201_2c_20tuple_3c_20_5ftail_2e_2e_2e_20_3e_20_3e_660',['tuple_element< __i - 1, tuple< _Tail... > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01715.html',1,'']]], + ['tuple_5felement_3c_20_5f_5fi_2c_20tuple_3c_20_5fhead_2c_20_5ftail_2e_2e_2e_20_3e_20_3e_661',['tuple_element< __i, tuple< _Head, _Tail... > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02955.html',1,'std']]], + ['tuple_5felement_3c_20_5f_5fi_2c_20tuple_3c_3e_20_3e_662',['tuple_element< __i, tuple<> >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02963.html',1,'std']]], + ['tuple_5felement_3c_20_5fint_2c_20_3a_3aarray_3c_20_5ftp_2c_20_5fnm_20_3e_20_3e_663',['tuple_element< _Int, ::array< _Tp, _Nm > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01719.html',1,'std']]], + ['tuple_5felement_3c_20_5fint_2c_20std_3a_3a_5f_5fdebug_3a_3aarray_3c_20_5ftp_2c_20_5fnm_20_3e_20_3e_664',['tuple_element< _Int, std::__debug::array< _Tp, _Nm > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08823.html',1,'std']]], + ['tuple_5fsize_665',['tuple_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01707.html',1,'std']]], + ['tuple_5fsize_3c_20std_3a_3a_5f_5fdebug_3a_3aarray_3c_20_5ftp_2c_20_5fnm_20_3e_20_3e_666',['tuple_size< std::__debug::array< _Tp, _Nm > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08819.html',1,'std']]], + ['tuple_5fsize_3c_20std_3a_3apair_3c_20_5ftp1_2c_20_5ftp2_20_3e_20_3e_667',['tuple_size< std::pair< _Tp1, _Tp2 > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04575.html',1,'std']]], + ['tuple_5fsize_3c_20tuple_3c_20_5felements_2e_2e_2e_20_3e_20_3e_668',['tuple_size< tuple< _Elements... > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02951.html',1,'std']]], + ['tuple_5fsize_3c_3a_3aarray_3c_20_5ftp_2c_20_5fnm_20_3e_20_3e_669',['tuple_size<::array< _Tp, _Nm > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01711.html',1,'std']]], + ['tupletraits_670',['TupleTraits',['https://docs.opencv.org/4.2.0/dd/d08/structcv_1_1cudev_1_1TupleTraits.html',1,'cv::cudev']]], + ['tupletraits_3c_20tuple_3c_20p0_2c_20p1_2c_20p2_2c_20p3_2c_20p4_2c_20p5_2c_20p6_2c_20p7_2c_20p8_2c_20p9_20_3e_20_3e_671',['TupleTraits< tuple< P0, P1, P2, P3, P4, P5, P6, P7, P8, P9 > >',['https://docs.opencv.org/4.2.0/d2/dae/structcv_1_1cudev_1_1TupleTraits_3_01tuple_3_01P0_00_01P1_00_01P2_00_01P3_00_01P4_00_01P5_00_01P41642a2d25b95a5ddb87ca2004b28336.html',1,'cv::cudev']]], + ['turnaround_672',['turnaround',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a39055bc42fd5822e8a3a2c9639c3612a',1,'cv::datasets::turnaround'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a39055bc42fd5822e8a3a2c9639c3612a',1,'turnaround(Global Namespace)']]], + ['turquoise_673',['turquoise',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a6b3ce38104fa104c33c3ef353052a3ab',1,'cv::viz::Color']]], + ['tutorial_674',['Line Features Tutorial',['https://docs.opencv.org/4.2.0/df/dfa/tutorial_line_descriptor_main.html',1,'']]], + ['tutorial_675',['tutorial',['https://docs.opencv.org/4.2.0/db/d56/tutorial_capture_graycode_pattern.html',1,'Capture Gray code pattern tutorial'],['https://docs.opencv.org/4.2.0/d0/de8/tutorial_capture_sinusoidal_pattern.html',1,'Capture Sinusoidal pattern tutorial'],['https://docs.opencv.org/4.2.0/dc/da9/tutorial_decode_graycode_pattern.html',1,'Decode Gray code pattern tutorial'],['https://docs.opencv.org/4.2.0/db/d74/tutorial_unwrap_phase_map.html',1,'Phase Unwrapping tutorial']]], + ['tutorial_20on_20facial_20landmark_20detector_20api_676',['Tutorial on Facial Landmark Detector API',['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'']]], + ['tutorial_2emarkdown_677',['tutorial.markdown',['https://docs.opencv.org/4.2.0/de/dee/tutorial_8markdown.html',1,'']]], + ['tutorial_5fcross_5freferencing_2emarkdown_678',['tutorial_cross_referencing.markdown',['https://docs.opencv.org/4.2.0/d2/d84/tutorial__cross__referencing_8markdown.html',1,'']]], + ['tutorial_5fcustomizing_5fcn_5ftracker_2emarkdown_679',['tutorial_customizing_cn_tracker.markdown',['https://docs.opencv.org/4.2.0/d0/dbd/tutorial__customizing__cn__tracker_8markdown.html',1,'']]], + ['tutorial_5fdecode_5fpattern_2emarkdown_680',['tutorial_decode_pattern.markdown',['https://docs.opencv.org/4.2.0/df/d46/tutorial__decode__pattern_8markdown.html',1,'']]], + ['tutorial_5fintroduction_5fto_5ftracker_2emarkdown_681',['tutorial_introduction_to_tracker.markdown',['https://docs.opencv.org/4.2.0/d9/d41/tutorial__introduction__to__tracker_8markdown.html',1,'']]], + ['tutorial_5fmultitracker_2emarkdown_682',['tutorial_multitracker.markdown',['https://docs.opencv.org/4.2.0/d2/dcc/tutorial__multitracker_8markdown.html',1,'']]], + ['tutorials_683',['Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'Introduction to OpenCV-Python Tutorials'],['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'Introduction to OpenCV.js and Tutorials'],['https://docs.opencv.org/4.2.0/d9/df8/tutorial_root.html',1,'OpenCV Tutorials'],['https://docs.opencv.org/4.2.0/d6/d00/tutorial_py_root.html',1,'OpenCV-Python Tutorials'],['https://docs.opencv.org/4.2.0/d5/d10/tutorial_js_root.html',1,'OpenCV.js Tutorials']]], + ['tutorials_684',['tutorials',['https://docs.opencv.org/4.2.0/d7/d36/tutorial_fuzzy.html',1,'Fuzzy image processing tutorials'],['https://docs.opencv.org/4.2.0/d3/d81/tutorial_structured_light.html',1,'Structured Light tutorials']]], + ['tutorials_20for_20bgsegm_20module_685',['Tutorials for bgsegm module',['https://docs.opencv.org/4.2.0/d3/d89/tutorial_table_of_content_bgsegm.html',1,'']]], + ['tutorials_20for_20contrib_20modules_686',['Tutorials for contrib modules',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_contrib_root.html',1,'']]], + ['tutorials_20for_20face_20module_687',['Tutorials for face module',['https://docs.opencv.org/4.2.0/de/d27/tutorial_table_of_content_face.html',1,'']]], + ['tutorials_2emarkdown_688',['tutorials.markdown',['https://docs.opencv.org/4.2.0/d7/d54/tutorials_8markdown.html',1,'']]], + ['tutorialsparse_5fexample_5fdetails_689',['TutorialSparse_example_details',['https://eigen.tuxfamily.org/dox/TutorialSparse_example_details.html',1,'']]], + ['twistedby_690',['twistedBy',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'Eigen::SparseMatrixBase::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< Transpose< MatrixType > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#acde15b45cf7b43520e1005ec65d55f3c',1,'Eigen::SparseSelfAdjointView::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#acde15b45cf7b43520e1005ec65d55f3c',1,'SparseSelfAdjointView< const Derived, UpLo >::twistedBy()']]], + ['two_20dimensional_20phase_20maps_691',['Unwrap two-dimensional phase maps',['https://docs.opencv.org/4.2.0/d9/dfb/tutorial_unwrap.html',1,'']]], + ['two_20images_20using_20opencv_692',['Adding (blending) two images using OpenCV',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_adding_images.html',1,'']]], + ['twopassstabilizer_693',['TwoPassStabilizer',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html',1,'cv::videostab::TwoPassStabilizer'],['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a6d8ba225fb09b05323886e9195f8589b',1,'cv::videostab::TwoPassStabilizer::TwoPassStabilizer()']]], + ['type_694',['TYPE',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07',1,'cv::instr']]], + ['type_695',['Type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01539.html',1,'Data Structure Type'],['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39',1,'cv::viz::MouseEvent::Type'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57',1,'cv::TermCriteria::Type'],['https://docs.opencv.org/4.2.0/d0/d9e/structcv_1_1Accumulator.html#ad5bc00e84ea9780e0194fafdf2a95cbb',1,'cv::Accumulator::Type'],['https://docs.opencv.org/4.2.0/d3/d2d/structcv_1_1Accumulator_3_01char_01_4.html#a81b49efd978faaac393e11a4a93fbf26',1,'cv::Accumulator< char >::Type'],['https://docs.opencv.org/4.2.0/d8/dcf/structcv_1_1Accumulator_3_01short_01_4.html#a77fcd7bec156efe951d0204bbb389d13',1,'cv::Accumulator< short >::Type'],['https://docs.opencv.org/4.2.0/d6/d89/structcv_1_1Accumulator_3_01unsigned_01char_01_4.html#a56e36b86fad200b8ae19c219574a1ac2',1,'cv::Accumulator< unsigned char >::Type'],['https://docs.opencv.org/4.2.0/d9/d84/structcv_1_1Accumulator_3_01unsigned_01short_01_4.html#a81f22b96482f59175a9db504ddcbf281',1,'cv::Accumulator< unsigned short >::Type']]], + ['type_696',['type',['https://eigen.tuxfamily.org/dox/TopicNewExpressionType.html',1,'Adding a new expression type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11587.html',1,'__gnu_pbds::detail::entry_cmp< _VTp, Cmp_Fn, _Alloc, false >::type'],['https://docs.opencv.org/4.2.0/d9/d6a/structcv_1_1cudev_1_1ConvertTuple.html#ac3700fd1fa65ba5c6a9ac74880f1084a',1,'cv::cudev::ConvertTuple::type'],['https://docs.opencv.org/4.2.0/dd/d3b/structcv_1_1detail_1_1flatten__g.html#a1bde1abb9b14be3539eee9e87205feba',1,'cv::detail::flatten_g::type'],['https://docs.opencv.org/4.2.0/df/de8/structcv_1_1detail_1_1flatten__g_3_01cv_1_1GMat_01_4.html#a76182a030c0c9939889096ee0d460792',1,'cv::detail::flatten_g< cv::GMat >::type'],['https://docs.opencv.org/4.2.0/d5/d97/structcv_1_1detail_1_1flatten__g_3_01cv_1_1GScalar_01_4.html#ab851de155fbb7845cbeafa2a19f5de03',1,'cv::detail::flatten_g< cv::GScalar >::type'],['https://docs.opencv.org/4.2.0/d8/d4e/structcv_1_1cudev_1_1functional__detail_1_1FloatType.html#a8f803719928d9f1dec322fc15085573d',1,'cv::cudev::functional_detail::FloatType::type'],['https://docs.opencv.org/4.2.0/d2/d54/structcv_1_1detail_1_1GTypeOf_3_01cv_1_1gapi_1_1own_1_1Mat_01_4.html#ac180264c4a42b1910184286ae6c97e93',1,'cv::detail::GTypeOf< cv::gapi::own::Mat >::type'],['https://docs.opencv.org/4.2.0/d6/d6f/structcv_1_1detail_1_1GTypeOf_3_01cv_1_1gapi_1_1own_1_1Scalar_01_4.html#a52f6341eb49810a18efcb815eb06e960',1,'cv::detail::GTypeOf< cv::gapi::own::Scalar >::type'],['https://docs.opencv.org/4.2.0/d0/d42/structcv_1_1detail_1_1GTypeOf_3_01cv_1_1gapi_1_1wip_1_1IStreamSource_1_1Ptr_01_4.html#a5aebb9bfa662eaaaea36ea494b779b94',1,'cv::detail::GTypeOf< cv::gapi::wip::IStreamSource::Ptr >::type'],['https://docs.opencv.org/4.2.0/d4/da4/structcv_1_1detail_1_1GTypeOf_3_01cv_1_1Mat_01_4.html#ada4d0d0a5311ace96a96ff4fa49ce76d',1,'cv::detail::GTypeOf< cv::Mat >::type'],['https://docs.opencv.org/4.2.0/de/d80/structcv_1_1detail_1_1GTypeOf_3_01cv_1_1Scalar_01_4.html#a836f56410d99a7a756116862c6d6a612',1,'cv::detail::GTypeOf< cv::Scalar >::type'],['https://docs.opencv.org/4.2.0/d6/d6a/structcv_1_1detail_1_1GTypeOf_3_01cv_1_1UMat_01_4.html#ab40940941d89769905586e316c96244c',1,'cv::detail::GTypeOf< cv::UMat >::type'],['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1GTypeOf_3_01std_1_1vector_3_01U_01_4_01_4.html#a60a7e94845175df8777a35d886b86627',1,'cv::detail::GTypeOf< std::vector< U > >::type'],['https://docs.opencv.org/4.2.0/d3/dc8/structcv_1_1detail_1_1has__custom__wrap.html#a93046c1542d94f9770df3420552e5085',1,'cv::detail::has_custom_wrap::type'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1cudev_1_1LargerType.html#a5faaef9dc50f0b9345d1ab87493a927d',1,'cv::cudev::LargerType::type'],['https://docs.opencv.org/4.2.0/d9/d0f/structcv_1_1cudev_1_1MakeVec_3_01bool_00_011_01_4.html#afa0c2544bc30b406aa412d9bc2bb16b4',1,'cv::cudev::MakeVec< bool, 1 >::type'],['https://docs.opencv.org/4.2.0/d1/d2c/structcv_1_1cudev_1_1MakeVec_3_01bool_00_012_01_4.html#acdb401965058d841a79c19899d2ff046',1,'cv::cudev::MakeVec< bool, 2 >::type'],['https://docs.opencv.org/4.2.0/dc/d8f/structcv_1_1cudev_1_1MakeVec_3_01bool_00_013_01_4.html#a3d173af25e6662635a8135df9434201d',1,'cv::cudev::MakeVec< bool, 3 >::type'],['https://docs.opencv.org/4.2.0/d2/d91/structcv_1_1cudev_1_1MakeVec_3_01bool_00_014_01_4.html#a64440622aa8006e7cb0bb0ed93aaee24',1,'cv::cudev::MakeVec< bool, 4 >::type'],['https://docs.opencv.org/4.2.0/d7/d64/structcv_1_1cudev_1_1MakeVec_3_01double_00_011_01_4.html#ae458072d3673d80c02e922eaf9d059a9',1,'cv::cudev::MakeVec< double, 1 >::type'],['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1MakeVec_3_01double_00_012_01_4.html#a4761407f978c6ad25a3c34dfa6bcc14b',1,'cv::cudev::MakeVec< double, 2 >::type'],['https://docs.opencv.org/4.2.0/d9/def/structcv_1_1cudev_1_1MakeVec_3_01double_00_013_01_4.html#a727211ee12e5a5b182b7c514138f8713',1,'cv::cudev::MakeVec< double, 3 >::type'],['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1MakeVec_3_01double_00_014_01_4.html#a293792b89b346b3c0663be77d01556a7',1,'cv::cudev::MakeVec< double, 4 >::type'],['https://docs.opencv.org/4.2.0/dd/d2b/structcv_1_1cudev_1_1MakeVec_3_01float_00_011_01_4.html#a7899bdfd8f324f2702ec18a4e273a22d',1,'cv::cudev::MakeVec< float, 1 >::type'],['https://docs.opencv.org/4.2.0/dc/de9/structcv_1_1cudev_1_1MakeVec_3_01float_00_012_01_4.html#af55247357ced93bbe76969c24e06d864',1,'cv::cudev::MakeVec< float, 2 >::type'],['https://docs.opencv.org/4.2.0/d8/d06/structcv_1_1cudev_1_1MakeVec_3_01float_00_013_01_4.html#a869aa8d1c71af84b1e3446368fbe08a3',1,'cv::cudev::MakeVec< float, 3 >::type'],['https://docs.opencv.org/4.2.0/da/d45/structcv_1_1cudev_1_1MakeVec_3_01float_00_014_01_4.html#a855d60b7fadd7ed1443332fd9c3525f3',1,'cv::cudev::MakeVec< float, 4 >::type'],['https://docs.opencv.org/4.2.0/db/d3a/structcv_1_1cudev_1_1MakeVec_3_01schar_00_011_01_4.html#ac7864980fab32efa4e33e5d60beab87b',1,'cv::cudev::MakeVec< schar, 1 >::type'],['https://docs.opencv.org/4.2.0/d4/d20/structcv_1_1cudev_1_1MakeVec_3_01schar_00_012_01_4.html#a24f2e7b793fdb3223f0dc70da8e96d04',1,'cv::cudev::MakeVec< schar, 2 >::type'],['https://docs.opencv.org/4.2.0/db/d3e/structcv_1_1cudev_1_1MakeVec_3_01schar_00_013_01_4.html#a7f8c6c5729c43f3c145fab5c3625c1a4',1,'cv::cudev::MakeVec< schar, 3 >::type'],['https://docs.opencv.org/4.2.0/d0/de6/structcv_1_1cudev_1_1MakeVec_3_01schar_00_014_01_4.html#a6ebcebe0bfd9f00029b9f60310942778',1,'cv::cudev::MakeVec< schar, 4 >::type'],['https://docs.opencv.org/4.2.0/d9/d00/structcv_1_1cudev_1_1MakeVec_3_01short_00_011_01_4.html#ad5e661748bb4af3388365310cbcf7119',1,'cv::cudev::MakeVec< short, 1 >::type'],['https://docs.opencv.org/4.2.0/d8/df8/structcv_1_1cudev_1_1MakeVec_3_01short_00_012_01_4.html#aef7d69b6314e8018e8a89bb7366c63fb',1,'cv::cudev::MakeVec< short, 2 >::type'],['https://docs.opencv.org/4.2.0/d6/d37/structcv_1_1cudev_1_1MakeVec_3_01short_00_013_01_4.html#a4c8257a923e78b07cc8bb5a908e12fdd',1,'cv::cudev::MakeVec< short, 3 >::type'],['https://docs.opencv.org/4.2.0/d1/da2/structcv_1_1cudev_1_1MakeVec_3_01short_00_014_01_4.html#a50305c204ab317c3981b24be1ba24266',1,'cv::cudev::MakeVec< short, 4 >::type'],['https://docs.opencv.org/4.2.0/db/de4/structcv_1_1cudev_1_1MakeVec_3_01uchar_00_011_01_4.html#a5318458d3974a8690854e7fff7c369bc',1,'cv::cudev::MakeVec< uchar, 1 >::type'],['https://docs.opencv.org/4.2.0/d0/d33/structcv_1_1cudev_1_1MakeVec_3_01uchar_00_012_01_4.html#a724d9fdf3a40fdccee9dedc50f048d8e',1,'cv::cudev::MakeVec< uchar, 2 >::type'],['https://docs.opencv.org/4.2.0/d7/d10/structcv_1_1cudev_1_1MakeVec_3_01uchar_00_013_01_4.html#adc5d6eee0d92ca86e5d28a639c963307',1,'cv::cudev::MakeVec< uchar, 3 >::type'],['https://docs.opencv.org/4.2.0/dd/dce/structcv_1_1cudev_1_1MakeVec_3_01uchar_00_014_01_4.html#a9807a06bbfb46a7fb0362f0927856d41',1,'cv::cudev::MakeVec< uchar, 4 >::type'],['https://docs.opencv.org/4.2.0/d9/d52/structcv_1_1cudev_1_1MakeVec_3_01uint_00_011_01_4.html#a8847869a3f6cb9abb08e2b51463b2775',1,'cv::cudev::MakeVec< uint, 1 >::type'],['https://docs.opencv.org/4.2.0/da/d68/structcv_1_1cudev_1_1MakeVec_3_01uint_00_012_01_4.html#a0ad56dea0099d66752310f1c6c576612',1,'cv::cudev::MakeVec< uint, 2 >::type'],['https://docs.opencv.org/4.2.0/d5/d1a/structcv_1_1cudev_1_1MakeVec_3_01uint_00_013_01_4.html#a39f46cdd3501ce5575e5cfa00b3a2a3b',1,'cv::cudev::MakeVec< uint, 3 >::type'],['https://docs.opencv.org/4.2.0/d3/df1/structcv_1_1cudev_1_1MakeVec_3_01uint_00_014_01_4.html#a5246931cd2bfcd3eb7bdb56678d899fb',1,'cv::cudev::MakeVec< uint, 4 >::type'],['https://docs.opencv.org/4.2.0/d4/d31/structcv_1_1cudev_1_1MakeVec_3_01ushort_00_011_01_4.html#a5ae4a1310d7fefdd3c3cb6f4a4f550e7',1,'cv::cudev::MakeVec< ushort, 1 >::type'],['https://docs.opencv.org/4.2.0/d3/d31/structcv_1_1cudev_1_1MakeVec_3_01ushort_00_012_01_4.html#ae99bd0ad2423cff46447a70c8779f75d',1,'cv::cudev::MakeVec< ushort, 2 >::type'],['https://docs.opencv.org/4.2.0/d4/d72/structcv_1_1cudev_1_1MakeVec_3_01ushort_00_013_01_4.html#ad62787645d0068fe2ffcd830e616b1a1',1,'cv::cudev::MakeVec< ushort, 3 >::type'],['https://docs.opencv.org/4.2.0/de/de5/structcv_1_1cudev_1_1MakeVec_3_01ushort_00_014_01_4.html#aef7573da7d54d0cf0bae3a90a7d5c59f',1,'cv::cudev::MakeVec< ushort, 4 >::type'],['https://docs.opencv.org/4.2.0/db/d79/structcv_1_1detail_1_1MetaType.html#a3294400b888903a23ea98dc5b5666f5f',1,'cv::detail::MetaType::type'],['https://docs.opencv.org/4.2.0/d4/d91/structcv_1_1detail_1_1MetaType_3_01cv_1_1GArray_3_01U_01_4_01_4.html#acc8c4a00d282678d859b1d8244d1f393',1,'cv::detail::MetaType< cv::GArray< U > >::type'],['https://docs.opencv.org/4.2.0/d0/dcf/structcv_1_1detail_1_1MetaType_3_01cv_1_1GMat_01_4.html#ae3fde27a067e489e03452436a4b0055d',1,'cv::detail::MetaType< cv::GMat >::type'],['https://docs.opencv.org/4.2.0/dc/d9f/structcv_1_1detail_1_1MetaType_3_01cv_1_1GMatP_01_4.html#a345fbf33f932ac53129c744294a428fb',1,'cv::detail::MetaType< cv::GMatP >::type'],['https://docs.opencv.org/4.2.0/de/d91/structcv_1_1detail_1_1MetaType_3_01cv_1_1GScalar_01_4.html#adba13704e7ce2d101b5e0112476bd939',1,'cv::detail::MetaType< cv::GScalar >::type'],['https://docs.opencv.org/4.2.0/dd/d51/structcv_1_1detail_1_1ProtoToMeta_3_01cv_1_1GArray_3_01U_01_4_01_4.html#a66f4135ae9b8c92a38e0ae6208ea2437',1,'cv::detail::ProtoToMeta< cv::GArray< U > >::type'],['https://docs.opencv.org/4.2.0/d0/d99/structcv_1_1detail_1_1ProtoToMeta_3_01cv_1_1GMat_01_4.html#abbf3271449ee4db6c65b91fc93868afd',1,'cv::detail::ProtoToMeta< cv::GMat >::type'],['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1detail_1_1ProtoToMeta_3_01cv_1_1GScalar_01_4.html#a2c70f67e114d74c2fbf66316c82bfd98',1,'cv::detail::ProtoToMeta< cv::GScalar >::type'],['https://docs.opencv.org/4.2.0/d5/d57/structcv_1_1detail_1_1ProtoToParam_3_01cv_1_1GArray_3_01U_01_4_01_4.html#afa7db1b0533ee857e3635c57390fee21',1,'cv::detail::ProtoToParam< cv::GArray< U > >::type'],['https://docs.opencv.org/4.2.0/dc/dc8/structcv_1_1detail_1_1ProtoToParam_3_01cv_1_1GMat_01_4.html#a6a52f9f8f5a816b52cfc447ef3aef486',1,'cv::detail::ProtoToParam< cv::GMat >::type'],['https://docs.opencv.org/4.2.0/de/d65/structcv_1_1detail_1_1ProtoToParam_3_01cv_1_1GScalar_01_4.html#ae8587e10bfee0439487befb68a8737a9',1,'cv::detail::ProtoToParam< cv::GScalar >::type'],['https://docs.opencv.org/4.2.0/d8/d1b/structcv_1_1cudev_1_1SelectIf.html#a62f051e67a8da33f598647c592aa8dc4',1,'cv::cudev::SelectIf::type'],['https://docs.opencv.org/4.2.0/dd/da7/structcv_1_1cudev_1_1SelectIf_3_01false_00_01ThenType_00_01ElseType_01_4.html#a58abc027d4ea072c5ae101256ba57655',1,'cv::cudev::SelectIf< false, ThenType, ElseType >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11447.html#adbbd8131d9a4cdc53e280a34f161dd3c',1,'__gnu_pbds::detail::container_base_dispatch< _VTp, Cmp_Fn, _Alloc, binary_heap_tag, null_type >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11439.html#ab4cecfd9b1ed21229fe049cabebe321c',1,'__gnu_pbds::detail::container_base_dispatch< _VTp, Cmp_Fn, _Alloc, binomial_heap_tag, null_type >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11435.html#adecf3a56bd35a5ca376d0492e7123a7b',1,'__gnu_pbds::detail::container_base_dispatch< _VTp, Cmp_Fn, _Alloc, pairing_heap_tag, null_type >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11443.html#a7d1df51ac2b0c2e893e450bf7fe9e379',1,'__gnu_pbds::detail::container_base_dispatch< _VTp, Cmp_Fn, _Alloc, rc_binomial_heap_tag, null_type >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11451.html#a9810405868a4fa2e115def4f7da71b66',1,'__gnu_pbds::detail::container_base_dispatch< _VTp, Cmp_Fn, _Alloc, thin_heap_tag, null_type >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11419.html#a23615b62e54e710b3434f9fa1ec9e3d1',1,'__gnu_pbds::detail::container_base_dispatch< Key, Mapped, _Alloc, cc_hash_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11427.html#abd5c9e94abb13133205d4974cb2c396f',1,'__gnu_pbds::detail::container_base_dispatch< Key, Mapped, _Alloc, gp_hash_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11379.html#acdf7426a920b3c4b7e483cd738099f08',1,'__gnu_pbds::detail::container_base_dispatch< Key, Mapped, _Alloc, list_update_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11411.html#a9dee3e80b552749aba49a387cfef6768',1,'__gnu_pbds::detail::container_base_dispatch< Key, Mapped, _Alloc, ov_tree_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11395.html#a4dc67d36e7e28cebbf0696edd715d8a6',1,'__gnu_pbds::detail::container_base_dispatch< Key, Mapped, _Alloc, rb_tree_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11403.html#a7539df56bb60708acd2660656ceee4a8',1,'__gnu_pbds::detail::container_base_dispatch< Key, Mapped, _Alloc, splay_tree_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11423.html#a3ecac13ca9bd3607b2cc2aba336c4c2c',1,'__gnu_pbds::detail::container_base_dispatch< Key, null_type, _Alloc, cc_hash_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11431.html#a315c9e64b8e3cf04bf9ca02ca72e5914',1,'__gnu_pbds::detail::container_base_dispatch< Key, null_type, _Alloc, gp_hash_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11383.html#a3567565c4791014129d9271f665960dd',1,'__gnu_pbds::detail::container_base_dispatch< Key, null_type, _Alloc, list_update_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11415.html#ac19add69b1550d2db0c651b84634ddca',1,'__gnu_pbds::detail::container_base_dispatch< Key, null_type, _Alloc, ov_tree_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11391.html#a52af7516d4c19d6fe0a0cbd61c047eb8',1,'__gnu_pbds::detail::container_base_dispatch< Key, null_type, _Alloc, pat_trie_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11407.html#a1d218c006e5fec5f988d65044d11b85f',1,'__gnu_pbds::detail::container_base_dispatch< Key, null_type, _Alloc, splay_tree_tag, Policy_Tl >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11463.html#acf71610ce6c7a4a66b87e61fbc3e7407',1,'__gnu_pbds::detail::default_comb_hash_fn::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11459.html#a504bba9208637bab17e2da42601884ba',1,'__gnu_pbds::detail::default_eq_fn::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11455.html#a9d4935ab2b6d39c2dd35d2d6d395b45a',1,'__gnu_pbds::detail::default_hash_fn::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11475.html#a37d9371e79bf6ce01e4bdcc723df1017',1,'__gnu_pbds::detail::default_probe_fn::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11467.html#a76f207395a752f928b216799653b005d',1,'__gnu_pbds::detail::default_resize_policy::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11483.html#a3d7eb49d274057829afe1bce8418ca14',1,'__gnu_pbds::detail::default_trie_access_traits< std::basic_string< Char, Char_Traits, std::allocator< char > > >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11471.html#a386b5f8ac62032f7854bec47c859d9b8',1,'__gnu_pbds::detail::default_update_policy::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11579.html#aec3a9bedeb284ef0b99f1a279adae4c3',1,'__gnu_pbds::detail::entry_cmp< _VTp, Cmp_Fn, _Alloc, true >::type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04211.html#a27bdde80c654d1c5253c899d71c8885c',1,'std::aligned_union::type'],['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html#a8cadd5042039048f71cf93b124bd6ae1',1,'cv::gapi::fluid::Border::type'],['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#ae716a59c79a20a2a2660096d1dd47b18',1,'cv::datasets::GR_skigObj::type'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a5f3cdb2524e281094e14e212a76a2d38',1,'cv::dnn::Layer::type'],['https://docs.opencv.org/4.2.0/db/db6/classcv_1_1dnn_1_1LayerParams.html#a0dbcba5635f513704ca7adc9cf6eff78',1,'cv::dnn::LayerParams::type'],['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#a3e337cb0a0f44b15570db74e19734319',1,'cv::dnn::LRNLayer::type'],['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#aeb8ea847034d9ffc4383463b8bc9cf51',1,'cv::viz::MouseEvent::type'],['https://docs.opencv.org/4.2.0/db/d0d/structcv_1_1ParamType_3_01__Tp_00_01typename_01std_1_1enable__if_3_01std_1_1is__enum_3_01__Tp_01_4_1_1value_01_4_1_1type_01_4.html#a755920f56cc55a3b84639a239cd8a693',1,'cv::ParamType< _Tp, typename std::enable_if< std::is_enum< _Tp >::value >::type >::type'],['https://docs.opencv.org/4.2.0/d2/d39/structcv_1_1ParamType_3_01Algorithm_01_4.html#a9beda664abde9aea9f7fff830efd45d5',1,'cv::ParamType< Algorithm >::type'],['https://docs.opencv.org/4.2.0/d1/d87/structcv_1_1ParamType_3_01bool_01_4.html#a5610b45e4cd056719b4adcce0eb3ca6d',1,'cv::ParamType< bool >::type'],['https://docs.opencv.org/4.2.0/d4/d98/structcv_1_1ParamType_3_01double_01_4.html#a660d6da1905d6629a751bc7f42e9385d',1,'cv::ParamType< double >::type'],['https://docs.opencv.org/4.2.0/dd/df2/structcv_1_1ParamType_3_01float_01_4.html#a92a7b876f64901f0de84324ee6cbc591',1,'cv::ParamType< float >::type'],['https://docs.opencv.org/4.2.0/db/d5f/structcv_1_1ParamType_3_01Mat_01_4.html#af3d584cd4298ae018142ef42646cc10a',1,'cv::ParamType< Mat >::type'],['https://docs.opencv.org/4.2.0/d2/dda/structcv_1_1ParamType_3_01Scalar_01_4.html#a7fc7375ade85917f5ced53fe367dc32b',1,'cv::ParamType< Scalar >::type'],['https://docs.opencv.org/4.2.0/dc/d1c/structcv_1_1ParamType_3_01std_1_1vector_3_01Mat_01_4_01_4.html#aa6210114e54ac35e2477513ecb02ea2a',1,'cv::ParamType< std::vector< Mat > >::type'],['https://docs.opencv.org/4.2.0/d0/d5f/structcv_1_1ParamType_3_01String_01_4.html#a8bbf1a9470dc13d3a3dff28e03a026a1',1,'cv::ParamType< String >::type'],['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1ParamType_3_01uchar_01_4.html#adf7b7b3ab6eb496d6817b093e4fcb09e',1,'cv::ParamType< uchar >::type'],['https://docs.opencv.org/4.2.0/dc/d63/structcv_1_1ParamType_3_01uint64_01_4.html#a9592ae25ee7b861fe339eb07bd4d10ed',1,'cv::ParamType< uint64 >::type'],['https://docs.opencv.org/4.2.0/d7/d68/structcv_1_1ParamType_3_01unsigned_01_4.html#a4f8b9f217561fdd22bca401c47526b62',1,'cv::ParamType< unsigned >::type'],['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a0cb63164efd77bbfabd77ff68ea5ce8d',1,'cv::dnn::PoolingLayer::type'],['https://docs.opencv.org/4.2.0/d7/d56/structcv_1_1datasets_1_1SLAM__tumindoorObj.html#a351c8eb553d89b00cb00a6dac0cd2107',1,'cv::datasets::SLAM_tumindoorObj::type'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a1ab7160b93aac1aa5ae015560d6fa5ae',1,'cv::TermCriteria::type'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a908ed821dcfd03b5cd1de763885537a3',1,'cv::Subdiv2D::Vertex::type'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#aad62862c81d1d5bdf3f6597a32585844',1,'cv::_InputArray::type()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#acdbc4c711bfbf0c8be705398e4ca583e',1,'cv::ogl::Buffer::type()'],['https://docs.opencv.org/4.2.0/dc/d89/structcv_1_1flann_1_1CvType_3_01char_01_4.html#a3bb1d61d10c2013d99637a15fe327569',1,'cv::flann::CvType< char >::type()'],['https://docs.opencv.org/4.2.0/dc/d69/structcv_1_1flann_1_1CvType_3_01double_01_4.html#a2f87d947b1f72e0c80650fc657e1cbec',1,'cv::flann::CvType< double >::type()'],['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1flann_1_1CvType_3_01float_01_4.html#ae7bbff9f8eb419211f60dba3fb96bd04',1,'cv::flann::CvType< float >::type()'],['https://docs.opencv.org/4.2.0/d2/def/structcv_1_1flann_1_1CvType_3_01short_01_4.html#a578abd72b21a13835ad2539c4b09751b',1,'cv::flann::CvType< short >::type()'],['https://docs.opencv.org/4.2.0/d7/da5/structcv_1_1flann_1_1CvType_3_01unsigned_01char_01_4.html#aa68ea25cde8d8bdbab5ab3c1856a4b68',1,'cv::flann::CvType< unsigned char >::type()'],['https://docs.opencv.org/4.2.0/d9/d57/structcv_1_1flann_1_1CvType_3_01unsigned_01short_01_4.html#ab4c8c75d6aa55b00f8edc13f7e5368be',1,'cv::flann::CvType< unsigned short >::type()'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ac8cfab2ef82010b6505683000e3652f7',1,'cv::ocl::Device::type()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ad0fd448e25719a94320ebe574b87f997',1,'cv::FileNode::type()'],['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#a0d183c893967e06ed760d7d2dd4f4669',1,'cv::optflow::GPCTrainingSamples::type()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ab0c835e86e2af3c8fc14fee8a2937281',1,'cv::cuda::GpuMat::type()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#aca78acd1e054a20caf3427c2a36e898e',1,'cv::cudev::GpuMat_::type()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ac55673be0aa82cc6dbe7b17cf2c480ce',1,'cv::cuda::HostMem::type()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af2d2652e552d7de635988f18a84b53e5',1,'cv::Mat::type()'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#abff622ef7ef3019c18800de316c08963',1,'cv::gapi::own::Mat::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'cv::Mat_::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< double >::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< float >::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< uchar >::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< unsigned char >::type()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a65fb8ae8f21a136edfe6da122c5466fb',1,'cv::MatExpr::type()'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ac9fe29306a3f2243d2596180a37f4281',1,'cv::MatOp::type()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a3331bffc1409d61631d223169a950b25',1,'cv::SparseMat::type()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#abcd902283fa4eb7556499d0729196b30',1,'cv::SparseMat_::type()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a65194dd922bef59b349a4148cd39d675',1,'cv::UMat::type()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a283ebc4f962a66404be06dcbb512eff4',1,'std::experimental::fundamentals_v1::any::type()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5b7c4b35a0ad9f97474912a08965d7ad.html#a5b7c4b35a0ad9f97474912a08965d7ad',1,'nlohmann::basic_json::type()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html',1,'Type-safe container of any type']]], + ['type_20safe_20container_20of_20any_20type_697',['Type-safe container of any type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html',1,'']]], + ['type1_698',['type1',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#a32db8f0b08a582326de2ecc1e2baea10',1,'cv::datasets::HPE_humanevaObj']]], + ['type2_699',['type2',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#a6f03ab1a7944ee6a50a81404b8760e77',1,'cv::datasets::HPE_humanevaObj']]], + ['type_5f5_5f8_700',['TYPE_5_8',['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08a16aa140499fc16449dfae5f095dc475c',1,'cv::FastFeatureDetector']]], + ['type_5f7_5f12_701',['TYPE_7_12',['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08af4be71a038c46401a0b431fcc994900d',1,'cv::FastFeatureDetector']]], + ['type_5f9_5f16_702',['TYPE_9_16',['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08a7a1af523673c330d43ec47081bcc55e3',1,'cv::FastFeatureDetector']]], + ['type_5faccelerator_703',['TYPE_ACCELERATOR',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2a3e0bdde0459301ccb652c1387997ae07',1,'cv::ocl::Device']]], + ['type_5fall_704',['TYPE_ALL',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2af32644a14837526000cb67fe3331fa10',1,'cv::ocl::Device']]], + ['type_5fbase_705',['type_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11539.html',1,'__gnu_pbds::detail']]], + ['type_5fbase_3c_20key_2c_20mapped_2c_20_5falloc_2c_20false_20_3e_706',['type_base< Key, Mapped, _Alloc, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11543.html',1,'__gnu_pbds::detail']]], + ['type_5fbase_3c_20key_2c_20mapped_2c_20_5falloc_2c_20true_20_3e_707',['type_base< Key, Mapped, _Alloc, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11547.html',1,'__gnu_pbds::detail']]], + ['type_5fbase_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20false_20_3e_708',['type_base< Key, null_type, _Alloc, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11551.html',1,'__gnu_pbds::detail']]], + ['type_5fbase_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20true_20_3e_709',['type_base< Key, null_type, _Alloc, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11555.html',1,'__gnu_pbds::detail']]], + ['type_5fcpu_710',['TYPE_CPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2ae3f66c5131806996dd0a77dcc27b5cdb',1,'cv::ocl::Device']]], + ['type_5fdefault_711',['TYPE_DEFAULT',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2a85e501bfc1d0b86cc5a00b3231169594',1,'cv::ocl::Device']]], + ['type_5fdgpu_712',['TYPE_DGPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2ade0b46bcd7730a122fc2db365d46f134',1,'cv::ocl::Device']]], + ['type_5fdispatch_713',['type_dispatch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11559.html',1,'__gnu_pbds::detail']]], + ['type_5ferror_714',['type_error',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ace5bf851eafe85bd6332f978991bc11c.html#ace5bf851eafe85bd6332f978991bc11c',1,'nlohmann::basic_json']]], + ['type_5ffun_715',['TYPE_FUN',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a76e4e851a896def5b60f25367f44ac6f',1,'cv::instr']]], + ['type_5fgeneral_716',['TYPE_GENERAL',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a289321828657503ab1539ad17904a925',1,'cv::instr']]], + ['type_5fgpu_717',['TYPE_GPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2aeb33963824886f155640fbcaef41d31f',1,'cv::ocl::Device']]], + ['type_5figpu_718',['TYPE_IGPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2a5a9bc4ea9b8ef84cd24a3289e4bd2d9d',1,'cv::ocl::Device']]], + ['type_5findex_719',['type_index',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03047.html',1,'std']]], + ['type_5finfo_720',['type_info',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01679.html',1,'std']]], + ['type_5flist_5findex_721',['type_list_index',['https://docs.opencv.org/4.2.0/d4/d46/structcv_1_1util_1_1type__list__index.html',1,'cv::util']]], + ['type_5flist_5findex_5fhelper_722',['type_list_index_helper',['https://docs.opencv.org/4.2.0/d1/d34/structcv_1_1util_1_1detail_1_1type__list__index__helper.html',1,'cv::util::detail']]], + ['type_5flist_5findex_5fhelper_3c_20i_2c_20target_2c_20first_20_3e_723',['type_list_index_helper< I, Target, First >',['https://docs.opencv.org/4.2.0/df/dfa/structcv_1_1util_1_1detail_1_1type__list__index__helper_3_01I_00_01Target_00_01First_01_4.html',1,'cv::util::detail']]], + ['type_5fmarker_724',['TYPE_MARKER',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a0025497a8b803c1564fa60d01c628247',1,'cv::instr']]], + ['type_5fmask_725',['TYPE_MASK',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a7367dc60b8963971f3c8f34dc075ebd6',1,'cv::FileNode::TYPE_MASK'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa6207c8cf9a3e442f153dc0241aea600a03b3e6a1defa1189b67c9f3d70b7c448',1,'cv::Mat::TYPE_MASK'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a6ecf93c4dac94616b02918ad5b3892d5abb9b861c1d3e39f5d4194c49c44c3c90',1,'cv::gapi::own::detail::MatHeader::TYPE_MASK'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a253082dc73b6e195968b5cd6ad10c71bacfda75d2f03eb3b2dc71e9654b5bef46',1,'cv::UMat::TYPE_MASK']]], + ['type_5fname_726',['type_name',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a459dbfcd47bd632ca82ca8ff8db278c8.html#a459dbfcd47bd632ca82ca8ff8db278c8',1,'nlohmann::basic_json']]], + ['type_5ftraits_727',['type_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00167.html',1,'']]], + ['type_5ftraits_2eh_728',['type_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01097.html',1,'']]], + ['type_5ftraits_2ehpp_729',['type_traits.hpp',['https://docs.opencv.org/4.2.0/d8/dbd/modules_2core_2include_2opencv2_2core_2cuda_2type__traits_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/daf/contrib_2modules_2cudev_2include_2opencv2_2cudev_2util_2type__traits_8hpp.html',1,'(Global Namespace)']]], + ['type_5futils_2ehpp_730',['type_utils.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01157.html',1,'']]], + ['type_5fwrapper_731',['TYPE_WRAPPER',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a3bb468f2996912301469d76be784c183',1,'cv::instr']]], + ['typedefs_732',['typedefs',['https://eigen.tuxfamily.org/dox/group__alignedboxtypedefs.html',1,'Global aligned box typedefs'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html',1,'Global array typedefs'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html',1,'Global matrix typedefs']]], + ['typehint_733',['TypeHint',['https://docs.opencv.org/4.2.0/df/dc2/structcv_1_1detail_1_1TypeHint.html',1,'cv::detail']]], + ['typehintbase_734',['TypeHintBase',['https://docs.opencv.org/4.2.0/d6/de4/structcv_1_1detail_1_1TypeHintBase.html',1,'cv::detail']]], + ['typeindex_735',['typeindex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00164.html',1,'']]], + ['typeinfo_736',['typeinfo',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00035.html',1,'']]], + ['typelist_2eh_737',['typelist.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01100.html',1,'']]], + ['typename_20keywords_20in_20c_738',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], + ['types_739',['Types',['https://docs.opencv.org/4.2.0/db/df1/group__gapi__data__objects.html',1,'G-API Data Types'],['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a22a5db4ceb750ca68782ddb32f44562f',1,'cv::ml::Boost::Types'],['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ad993005b665024ea3c067c4cccd4e898',1,'cv::ml::EM::Types'],['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#ab654e56b6b5b0745022b7ca054ef2c1c',1,'cv::ml::KNearest::Types'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44f',1,'cv::ml::SVM::Types']]], + ['types_740',['types',['https://eigen.tuxfamily.org/dox/TopicScalarTypes.html',1,'Scalar types'],['https://eigen.tuxfamily.org/dox/TopicCustomizing_CustomScalar.html',1,'Using custom scalar types']]], + ['types_20as_20parameters_741',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], + ['types_2eh_742',['types.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00977.html',1,'']]], + ['types_2ehpp_743',['types.hpp',['https://docs.opencv.org/4.2.0/db/dfc/modules_2core_2include_2opencv2_2core_2types_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d61/modules_2gapi_2include_2opencv2_2gapi_2own_2types_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d07/contrib_2modules_2fuzzy_2include_2opencv2_2fuzzy_2types_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d0e/contrib_2modules_2viz_2include_2opencv2_2viz_2types_8hpp.html',1,'(Global Namespace)']]], + ['types_5ftraits_744',['types_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11563.html',1,'__gnu_pbds::detail']]], + ['types_5ftraits_2ehpp_745',['types_traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01160.html',1,'']]], + ['types_5ftraits_3c_20key_2c_20mapped_2c_20_5falloc_2c_20false_20_3e_746',['types_traits< Key, Mapped, _Alloc, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11563.html',1,'']]], + ['typesequals_747',['TypesEquals',['https://docs.opencv.org/4.2.0/df/d71/structcv_1_1cudev_1_1TypesEquals.html',1,'cv::cudev']]], + ['typesequals_3c_20a_2c_20a_20_3e_748',['TypesEquals< A, A >',['https://docs.opencv.org/4.2.0/df/dbf/structcv_1_1cudev_1_1TypesEquals_3_01A_00_01A_01_4.html',1,'cv::cudev']]], + ['typetostr_749',['typeToStr',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga332498ad6301e733151ff4e61e0d755c',1,'cv::ocl::typeToStr()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga332498ad6301e733151ff4e61e0d755c',1,'typeToStr()(Global Namespace)']]], + ['typetostring_750',['typeToString',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a2b314c09591d8f79c334b7fd9dd3a9fd',1,'cv']]], + ['typetraits_751',['TypeTraits',['https://docs.opencv.org/4.2.0/d7/d97/structcv_1_1cudev_1_1TypeTraits.html',1,'cv::cudev']]] ]; diff --git a/search/all_1e.js b/search/all_1e.js index 3e14c8c1..89d8534a 100644 --- a/search/all_1e.js +++ b/search/all_1e.js @@ -13,14 +13,14 @@ var searchData= ['uint_10',['uint',['https://docs.opencv.org/4.2.0/d1/d1b/group__core__hal__interface.html#ga4f5fce8c1ef282264f9214809524d836',1,]]], ['uint16_5ft_11',['uint16_t',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#ab8f9e3c8d45fa2f89547aa6367185a6f',1,'cv']]], ['uint32_5ft_12',['uint32_t',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a2e2bf34f6d75c7c4bd05605e1c5e33e1',1,'cv']]], - ['uint64_13',['uint64',['https://docs.opencv.org/4.2.0/d1/d1b/group__core__hal__interface.html#gabc0f5bc07737e498f287334775dff2b6',1,]]], - ['uint64_14',['UINT64',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa6de7acf711860176ba606e9aa2b85d5f',1,'UINT64(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa6de7acf711860176ba606e9aa2b85d5f',1,'UINT64(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa6de7acf711860176ba606e9aa2b85d5f',1,'UINT64(Global Namespace)']]], + ['uint64_13',['UINT64',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa6de7acf711860176ba606e9aa2b85d5f',1,'UINT64(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa6de7acf711860176ba606e9aa2b85d5f',1,'UINT64(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aa6de7acf711860176ba606e9aa2b85d5f',1,'UINT64(Global Namespace)']]], + ['uint64_14',['uint64',['https://docs.opencv.org/4.2.0/d1/d1b/group__core__hal__interface.html#gabc0f5bc07737e498f287334775dff2b6',1,]]], ['uint64_5ft_15',['uint64_t',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a95a13348625f7bf50cc851d1fddea33b',1,'cv']]], ['uint8_5ft_16',['uint8_t',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a5637fae091197126a031b7594cccc9fe',1,'cv']]], ['uint_5ftype_17',['uint_type',['https://docs.opencv.org/4.2.0/d5/d9e/structcv_1_1V__TypeTraits_3_01double_01_4.html#a5f811ea62326d4df66c603fd438316e5',1,'cv::V_TypeTraits< double >::uint_type'],['https://docs.opencv.org/4.2.0/da/d19/structcv_1_1V__TypeTraits_3_01float_01_4.html#aa931a5d23e0dd081f8d610d058975143',1,'cv::V_TypeTraits< float >::uint_type'],['https://docs.opencv.org/4.2.0/db/d59/structcv_1_1V__TypeTraits_3_01int64_01_4.html#aae8a03c8397122007b91d0938ddd5551',1,'cv::V_TypeTraits< int64 >::uint_type'],['https://docs.opencv.org/4.2.0/d0/d9d/structcv_1_1V__TypeTraits_3_01schar_01_4.html#ae4a114bb8b6eeb38abc69304f4675ea4',1,'cv::V_TypeTraits< schar >::uint_type'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1V__TypeTraits_3_01short_01_4.html#a44d47c2f5f85b0b001dc0ec5e18a8533',1,'cv::V_TypeTraits< short >::uint_type'],['https://docs.opencv.org/4.2.0/dd/d1d/structcv_1_1V__TypeTraits_3_01uchar_01_4.html#a3a297873462ef6d91ab7474747af7da9',1,'cv::V_TypeTraits< uchar >::uint_type'],['https://docs.opencv.org/4.2.0/d2/d4d/structcv_1_1V__TypeTraits_3_01uint64_01_4.html#ac5a9d8c99db0a1794414bfc4d6a97d36',1,'cv::V_TypeTraits< uint64 >::uint_type'],['https://docs.opencv.org/4.2.0/d3/d8c/structcv_1_1V__TypeTraits_3_01unsigned_01_4.html#ad097e9b159dda2277f9688bb0bece65c',1,'cv::V_TypeTraits< unsigned >::uint_type'],['https://docs.opencv.org/4.2.0/d6/dd5/structcv_1_1V__TypeTraits_3_01ushort_01_4.html#afd21784f054bcbf02505013f3cc474a6',1,'cv::V_TypeTraits< ushort >::uint_type']]], ['ukfsystemmodel_18',['UkfSystemModel',['https://docs.opencv.org/4.2.0/da/d2b/classcv_1_1tracking_1_1UkfSystemModel.html',1,'cv::tracking']]], - ['umat_19',['UMat',['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html',1,'cv::UMat'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a63cb4da02e647fb49df1f40aab8ca35b',1,'cv::UMat::UMat(UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#add0dc0febd6a7b6a7a79a85d41bb17f2',1,'cv::UMat::UMat(int rows, int cols, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a1f0939f54199110a180cf5d8e4c8d725',1,'cv::UMat::UMat(Size size, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a16a02552218847de2e60ce907b5e904a',1,'cv::UMat::UMat(int rows, int cols, int type, const Scalar &s, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aa0e86661d2f62be94ed7648508f1ec07',1,'cv::UMat::UMat(Size size, int type, const Scalar &s, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#af159e956ff96c64745c6940a3b1820ba',1,'cv::UMat::UMat(int ndims, const int *sizes, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a5e1866c206e9c116304a0257bc3a6c50',1,'cv::UMat::UMat(int ndims, const int *sizes, int type, const Scalar &s, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a6afe62166cf5634b17ac54bdb16e8379',1,'cv::UMat::UMat(const UMat &m)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#afeaabd3e9eef98ccef422a81176a4250',1,'cv::UMat::UMat(const UMat &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aaa3fa04bb82fee6026cc2e85df96a796',1,'cv::UMat::UMat(const UMat &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a96f381979b76ce63d497e812fd7ec574',1,'cv::UMat::UMat(const UMat &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a577f91740a6ee96201049cad9b15c22d',1,'cv::UMat::UMat(const UMat &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a0edcf01672609ffb76bccc84e6039c4b',1,'cv::UMat::UMat(const std::vector< _Tp > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a316d6e8c8085dd465ecc8abb275092df',1,'cv::UMat::UMat(const Vec< _Tp, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a719d720e8f935c4dfed075f342d6a187',1,'cv::UMat::UMat(const Matx< _Tp, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a7591b42fc20467ef04a8bcf145397974',1,'cv::UMat::UMat(const Point_< _Tp > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ae75b7bb36992de47f96fc05c6272150e',1,'cv::UMat::UMat(const Point3_< _Tp > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#afd0d43167dfa37819c7af1debca8df16',1,'cv::UMat::UMat(const MatCommaInitializer_< _Tp > &commaInitializer)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ab2e3437a0cddfea4761f2f0d35ca08dd',1,'cv::UMat::UMat(UMat &&m)']]], - ['umat_20',['UMAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba3f0f082586ac549b0d2dc49dffc8b901',1,'cv::_InputArray']]], + ['umat_19',['UMAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba3f0f082586ac549b0d2dc49dffc8b901',1,'cv::_InputArray']]], + ['umat_20',['UMat',['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html',1,'cv::UMat'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a63cb4da02e647fb49df1f40aab8ca35b',1,'cv::UMat::UMat(UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#add0dc0febd6a7b6a7a79a85d41bb17f2',1,'cv::UMat::UMat(int rows, int cols, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a1f0939f54199110a180cf5d8e4c8d725',1,'cv::UMat::UMat(Size size, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a16a02552218847de2e60ce907b5e904a',1,'cv::UMat::UMat(int rows, int cols, int type, const Scalar &s, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aa0e86661d2f62be94ed7648508f1ec07',1,'cv::UMat::UMat(Size size, int type, const Scalar &s, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#af159e956ff96c64745c6940a3b1820ba',1,'cv::UMat::UMat(int ndims, const int *sizes, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a5e1866c206e9c116304a0257bc3a6c50',1,'cv::UMat::UMat(int ndims, const int *sizes, int type, const Scalar &s, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a6afe62166cf5634b17ac54bdb16e8379',1,'cv::UMat::UMat(const UMat &m)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#afeaabd3e9eef98ccef422a81176a4250',1,'cv::UMat::UMat(const UMat &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aaa3fa04bb82fee6026cc2e85df96a796',1,'cv::UMat::UMat(const UMat &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a96f381979b76ce63d497e812fd7ec574',1,'cv::UMat::UMat(const UMat &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a577f91740a6ee96201049cad9b15c22d',1,'cv::UMat::UMat(const UMat &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a0edcf01672609ffb76bccc84e6039c4b',1,'cv::UMat::UMat(const std::vector< _Tp > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a316d6e8c8085dd465ecc8abb275092df',1,'cv::UMat::UMat(const Vec< _Tp, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a719d720e8f935c4dfed075f342d6a187',1,'cv::UMat::UMat(const Matx< _Tp, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a7591b42fc20467ef04a8bcf145397974',1,'cv::UMat::UMat(const Point_< _Tp > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ae75b7bb36992de47f96fc05c6272150e',1,'cv::UMat::UMat(const Point3_< _Tp > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#afd0d43167dfa37819c7af1debca8df16',1,'cv::UMat::UMat(const MatCommaInitializer_< _Tp > &commaInitializer)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ab2e3437a0cddfea4761f2f0d35ca08dd',1,'cv::UMat::UMat(UMat &&m)']]], ['umatdata_21',['UMatData',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html',1,'cv::UMatData'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#acf6afbd0fafee36cafe5c10ff82cc45d',1,'cv::UMatData::UMatData()']]], ['umatusageflags_22',['UMatUsageFlags',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5681439dda418431eb0a672697135ed2',1,'cv::UMatUsageFlags'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga5681439dda418431eb0a672697135ed2',1,'UMatUsageFlags(Global Namespace)']]], ['umeyama_23',['umeyama',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gab3f5a82a24490b936f8694cf8fef8e60',1,'Eigen::umeyama()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gab3f5a82a24490b936f8694cf8fef8e60',1,'umeyama()(Global Namespace)']]], @@ -308,15 +308,12 @@ var searchData= ['util_305',['util',['../namespaceutil.html',1,'']]], ['util_2ehpp_306',['util.hpp',['https://docs.opencv.org/4.2.0/d9/d06/modules_2stitching_2include_2opencv2_2stitching_2detail_2util_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d59/modules_2gapi_2include_2opencv2_2gapi_2util_2util_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/d6b/contrib_2modules_2datasets_2include_2opencv2_2datasets_2util_8hpp.html',1,'(Global Namespace)']]], ['util_5finl_2ehpp_307',['util_inl.hpp',['https://docs.opencv.org/4.2.0/d7/dab/util__inl_8hpp.html',1,'']]], - ['utilities_308',['NEON utilities',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html',1,'']]], - ['utilities_309',['Random Number Utilities',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01547.html',1,'']]], - ['utilities_310',['SSE utilities',['https://docs.opencv.org/4.2.0/d6/d06/group__core__utils__sse.html',1,'']]], - ['utilities_311',['Utilities',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html',1,'']]], - ['utilities_312',['VSX utilities',['https://docs.opencv.org/4.2.0/d3/d50/group__core__utils__vsx.html',1,'']]], - ['utilities_20for_20new_20layers_20registration_313',['Utilities for New Layers Registration',['https://docs.opencv.org/4.2.0/df/dc1/group__dnnLayerFactory.html',1,'']]], - ['utility_314',['utility',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00176.html',1,'']]], - ['utility_20and_20system_20functions_20and_20macros_315',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], - ['utility_20functions_20for_20opencv_20samples_316',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]], - ['utility_2ehpp_317',['utility.hpp',['https://docs.opencv.org/4.2.0/df/dc3/cuda_2utility_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d4e/utility_8hpp.html',1,'(Global Namespace)']]], - ['utraindesccollection_318',['utrainDescCollection',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a66bd1ba0753ab3ebb792e7b4bf5af2ab',1,'cv::DescriptorMatcher']]] + ['utilities_308',['Utilities',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01547.html',1,'Random Number Utilities'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html',1,'Utilities']]], + ['utilities_309',['utilities',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html',1,'NEON utilities'],['https://docs.opencv.org/4.2.0/d6/d06/group__core__utils__sse.html',1,'SSE utilities'],['https://docs.opencv.org/4.2.0/d3/d50/group__core__utils__vsx.html',1,'VSX utilities']]], + ['utilities_20for_20new_20layers_20registration_310',['Utilities for New Layers Registration',['https://docs.opencv.org/4.2.0/df/dc1/group__dnnLayerFactory.html',1,'']]], + ['utility_311',['utility',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00176.html',1,'']]], + ['utility_20and_20system_20functions_20and_20macros_312',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], + ['utility_20functions_20for_20opencv_20samples_313',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]], + ['utility_2ehpp_314',['utility.hpp',['https://docs.opencv.org/4.2.0/df/dc3/cuda_2utility_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d4e/utility_8hpp.html',1,'(Global Namespace)']]], + ['utraindesccollection_315',['utrainDescCollection',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a66bd1ba0753ab3ebb792e7b4bf5af2ab',1,'cv::DescriptorMatcher']]] ]; diff --git a/search/all_1f.js b/search/all_1f.js index 081f102a..28e118f5 100644 --- a/search/all_1f.js +++ b/search/all_1f.js @@ -141,74 +141,74 @@ var searchData= ['v_5fuint8x16_138',['v_uint8x16',['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga15cd4df600c57ee36d03ccfee5cb9820',1,'cv::v_uint8x16'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga15cd4df600c57ee36d03ccfee5cb9820',1,'v_uint8x16(Global Namespace)']]], ['v_5fzip_139',['v_zip',['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga19ef6326f6c132d75c62391cedf7c187',1,'cv::v_zip()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga19ef6326f6c132d75c62391cedf7c187',1,'v_zip(const v_reg< _Tp, n > &a0, const v_reg< _Tp, n > &a1, v_reg< _Tp, n > &b0, v_reg< _Tp, n > &b1)(Global Namespace)']]], ['va_20api_20opencl_20cl_20va_20interoperability_140',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], - ['va_5fintel_2ehpp_141',['va_intel.hpp',['https://docs.opencv.org/4.2.0/d5/d8c/va__intel_8hpp.html',1,'']]], - ['vabsdiff2_142',['vabsdiff2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga198b2bfcacae3cbe61938bce671432ba',1,'cv::cudev::vabsdiff2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga198b2bfcacae3cbe61938bce671432ba',1,'vabsdiff2()(Global Namespace)']]], - ['vabsdiff4_143',['vabsdiff4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf86631ff00cb9e7cf5e60a0fcb23743d',1,'cv::cudev::vabsdiff4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf86631ff00cb9e7cf5e60a0fcb23743d',1,'vabsdiff4()(Global Namespace)']]], - ['vadd2_144',['vadd2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31016a43f185b5436a6057046b3a87e2',1,'cv::cudev::vadd2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31016a43f185b5436a6057046b3a87e2',1,'vadd2()(Global Namespace)']]], - ['vadd4_145',['vadd4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ba46e5d618d1b3a265053fb66695daa',1,'cv::cudev::vadd4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ba46e5d618d1b3a265053fb66695daa',1,'vadd4()(Global Namespace)']]], - ['val_146',['val',['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#ab0a675854cec81a16e4b3e8c724d3b95',1,'cv::cudev::BrdConstant::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'cv::Matx::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< _Tp, cn, 1 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, 1, 3 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, 2, 2 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, 2, 3 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, 3, 3 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, 3, 4 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, 4, 4 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, cn, 1 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< float, 2, 3 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< float, 3, 3 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< float, cn, 1 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< float_type, 4, 4 >::val'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#afb83970cca5d285744f915c60aee281a',1,'cv::gapi::own::Scalar::val']]], - ['valarray_147',['valarray',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04647.html',1,'std::valarray< _Tp >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00179.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga86cb8edd85b0f415ff434169746203b8',1,'std::valarray::valarray()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga97d87db7cf732f6df07a4bc214ab1b6c',1,'std::valarray::valarray(size_t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa3081177498d05f233dc919b723ac7ca',1,'std::valarray::valarray(const _Tp &, size_t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04647.html#a1ec188c5bae0bf1ee212da704cc1dc7a',1,'std::valarray::valarray(const _Tp *__restrict__, size_t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa097c18bfb82fa18eb77d561e3f3220d',1,'std::valarray::valarray(const valarray &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gacaf590f7e44f9aa8d247c026f2c6685a',1,'std::valarray::valarray(valarray &&) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa67c616cc84294b4ecfe9492e673e937',1,'std::valarray::valarray(const slice_array< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41d41b2154090e3aa77b2a8c8c1eafe2',1,'std::valarray::valarray(const gslice_array< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga341e360faf03730a2ad4ddb98bb84caa',1,'std::valarray::valarray(const mask_array< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4440404083086817b9e50ddecfa604fb',1,'std::valarray::valarray(const indirect_array< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa0445cb9da95df6871ea1c2b625aedf7',1,'std::valarray::valarray(initializer_list< _Tp >)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga86cb8edd85b0f415ff434169746203b8',1,'valarray< size_t >::valarray()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga97d87db7cf732f6df07a4bc214ab1b6c',1,'valarray< size_t >::valarray(size_t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa3081177498d05f233dc919b723ac7ca',1,'valarray< size_t >::valarray(const size_t &, size_t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04647.html#a1ec188c5bae0bf1ee212da704cc1dc7a',1,'valarray< size_t >::valarray(const size_t *__restrict__, size_t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa097c18bfb82fa18eb77d561e3f3220d',1,'valarray< size_t >::valarray(const valarray &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gacaf590f7e44f9aa8d247c026f2c6685a',1,'valarray< size_t >::valarray(valarray &&) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa67c616cc84294b4ecfe9492e673e937',1,'valarray< size_t >::valarray(const slice_array< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41d41b2154090e3aa77b2a8c8c1eafe2',1,'valarray< size_t >::valarray(const gslice_array< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga341e360faf03730a2ad4ddb98bb84caa',1,'valarray< size_t >::valarray(const mask_array< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4440404083086817b9e50ddecfa604fb',1,'valarray< size_t >::valarray(const indirect_array< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa0445cb9da95df6871ea1c2b625aedf7',1,'valarray< size_t >::valarray(initializer_list< size_t >)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga86cb8edd85b0f415ff434169746203b8',1,'valarray()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga97d87db7cf732f6df07a4bc214ab1b6c',1,'valarray(size_t)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa3081177498d05f233dc919b723ac7ca',1,'valarray(const _Tp &, size_t)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa097c18bfb82fa18eb77d561e3f3220d',1,'valarray(const valarray &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gacaf590f7e44f9aa8d247c026f2c6685a',1,'valarray(valarray &&) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa67c616cc84294b4ecfe9492e673e937',1,'valarray(const slice_array< _Tp > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41d41b2154090e3aa77b2a8c8c1eafe2',1,'valarray(const gslice_array< _Tp > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga341e360faf03730a2ad4ddb98bb84caa',1,'valarray(const mask_array< _Tp > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4440404083086817b9e50ddecfa604fb',1,'valarray(const indirect_array< _Tp > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa0445cb9da95df6871ea1c2b625aedf7',1,'valarray(initializer_list< _Tp >)(Global Namespace)']]], - ['valarray_3c_20size_5ft_20_3e_148',['valarray< size_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04647.html',1,'']]], - ['valarray_5fafter_2eh_149',['valarray_after.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00638.html',1,'']]], - ['valarray_5farray_2eh_150',['valarray_array.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00641.html',1,'']]], - ['valarray_5farray_2etcc_151',['valarray_array.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00644.html',1,'']]], - ['valarray_5fbefore_2eh_152',['valarray_before.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00647.html',1,'']]], - ['valid_153',['valid',['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a309514ce0d50e1529054d6f7e9cc23e2',1,'cv::AsyncArray']]], - ['valid_5fprefix_154',['valid_prefix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a02d5021b34020bc97aeb4ea618a92740',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::valid_prefix()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a02d5021b34020bc97aeb4ea618a92740',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::valid_prefix()']]], - ['valid_5fsize_155',['valid_size',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#aa6ca25bbf560a854e6eea010a89980e8',1,'OpenCV_API_Header']]], - ['validate_156',['validate',['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a8f53e513ca5a22ea0ecd896551c59664',1,'cv::detail::tracked_cv_mat::validate()'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a907c4700b70270adce7d25228e2e3ee5',1,'cv::detail::tracked_cv_umat::validate()']]], - ['validatedisparity_157',['validateDisparity',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga214b498b8d01d0417e0d08be64c54eb5',1,'cv::validateDisparity()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga214b498b8d01d0417e0d08be64c54eb5',1,'validateDisparity()(Global Namespace)']]], - ['validatekey_158',['validateKey',['../namespaceutil.html#acabe627a0fcfdd21b5170e4108c90c0b',1,'util::validateKey(const json &j, const std::string &key, const val_t &type)'],['../namespaceutil.html#a02c736fa7ad5a68e89f3f56be0235aff',1,'util::validateKey(const json &j, const std::string &key, const std::unordered_set< val_t > &types)']]], - ['validateoneof_159',['validateOneOf',['../namespaceutil.html#a222e14af5a8aee85361adc9670ce33b6',1,'util']]], - ['validaterange_160',['validateRange',['../namespaceutil.html#aa54731506a7b3ae7300a6937b59809d4',1,'util']]], - ['validation_161',['validation',['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html#af063eb99c4cf7d07cc5f642d9e6f1d7c',1,'cv::datasets::Dataset']]], - ['validgeometry_162',['validGeometry',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a98184e52f16c9b6ab80102bf29e910ec',1,'cv::Subdiv2D']]], - ['value_163',['value',['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html#a86df3b107a9d56e5f082ad9958f7d780',1,'cv::gapi::fluid::Border::value'],['https://docs.opencv.org/4.2.0/d6/dea/structcv_1_1detail_1_1callCustomGetBorder_3_01false_00_01Impl_01_4.html#ae74a09c3b3a8668fc8ab6b474be80b99',1,'cv::detail::callCustomGetBorder< false, Impl >::value'],['https://docs.opencv.org/4.2.0/d0/df2/structcv_1_1detail_1_1callCustomGetBorder_3_01true_00_01Impl_01_4.html#a07b8f3fffc221bc4b03fe2ee9b4ecec5',1,'cv::detail::callCustomGetBorder< true, Impl >::value'],['https://docs.opencv.org/4.2.0/d5/db7/structcv_1_1cudev_1_1ConstantPtr.html#aa5ce9b10fe30e8cf58117e9fcb430c8c',1,'cv::cudev::ConstantPtr::value'],['https://docs.opencv.org/4.2.0/d7/d0e/classcv_1_1DataDepth.html#a022386121e1e1241c5a999976d4b5956a7cb026110dca902585250642b85975d2',1,'cv::DataDepth::value'],['https://docs.opencv.org/4.2.0/d7/de1/classcv_1_1GArg.html#a1fcca49bc463558adaf3c62a7901ea94',1,'cv::GArg::value'],['https://docs.opencv.org/4.2.0/d3/dc8/structcv_1_1detail_1_1has__custom__wrap.html#ab3fedf93af8c8ba3495e3c14a75e100b',1,'cv::detail::has_custom_wrap::value'],['https://docs.opencv.org/4.2.0/d7/d1b/structcv_1_1detail_1_1has__Window.html#a003774e3ed8c680311caabf6b992d61f',1,'cv::detail::has_Window::value'],['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1cudev_1_1Int2Type.html#a8190711d0975b6d7d4b0e4e28536a7ffa30c67650242d5b240a90a7b989f03d16',1,'cv::cudev::Int2Type::value'],['https://docs.opencv.org/4.2.0/d9/dc3/structcv_1_1detail_1_1is__gmat__type.html#ae4a31fcdc3052f93ca55b848781bfdee',1,'cv::detail::is_gmat_type::value'],['https://docs.opencv.org/4.2.0/d1/de5/structcv_1_1cudev_1_1IsBinaryFunction.html#a970115452365e0902a36d496dab77ba7a90ad3b693ab1636982b2edc8890cb66f',1,'cv::cudev::IsBinaryFunction::value'],['https://docs.opencv.org/4.2.0/da/db4/structcv_1_1cudev_1_1IsPowerOf2.html#aa22c7b4dd3eafae98cb8428c852ef0adab32ea8ad86d2766541dbd8c20e29a9a6',1,'cv::cudev::IsPowerOf2::value'],['https://docs.opencv.org/4.2.0/d6/d82/structcv_1_1cudev_1_1IsUnaryFunction.html#a8ca9358fed14af43e87169ce69752eeea15389267bc101f4e4513f9be55c7a7bc',1,'cv::cudev::IsUnaryFunction::value'],['https://docs.opencv.org/4.2.0/d5/da6/structcv_1_1cudev_1_1Log2.html#aefde90de9934423b33c85769743c69caaf61f084c4b5cf2f65f4992b5ce3955c9',1,'cv::cudev::Log2::value'],['https://docs.opencv.org/4.2.0/d5/d16/structcv_1_1cudev_1_1Log2_3_01N_00_010_00_01COUNT_01_4.html#a43aa769f98bae02aa98c16877257175cac667b581a71abad6bb3069a8626160d4',1,'cv::cudev::Log2< N, 0, COUNT >::value'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#a93181d806c875eece1a13fd8ef9effa8',1,'cv::ml::DTrees::Node::value'],['https://docs.opencv.org/4.2.0/d3/d02/structcv_1_1datasets_1_1tag.html#aeb3f78239d7f8de2707e61590152264c',1,'cv::datasets::tag::value'],['https://docs.opencv.org/4.2.0/d4/d46/structcv_1_1util_1_1type__list__index.html#a15e82da10a9fbccdd671016177e3a640',1,'cv::util::type_list_index::value'],['https://docs.opencv.org/4.2.0/d1/d34/structcv_1_1util_1_1detail_1_1type__list__index__helper.html#ab4c129e6038154e7d8bd1cc3fcfd2991',1,'cv::util::detail::type_list_index_helper::value'],['https://docs.opencv.org/4.2.0/df/dfa/structcv_1_1util_1_1detail_1_1type__list__index__helper_3_01I_00_01Target_00_01First_01_4.html#a653e06ea12093d1eb70f79066e5cb5c7',1,'cv::util::detail::type_list_index_helper< I, Target, First >::value'],['https://docs.opencv.org/4.2.0/df/d71/structcv_1_1cudev_1_1TypesEquals.html#a52c3addfcc794233b5b9569a4f374cada00d77df089f100b5179bb3ad3e4c412b',1,'cv::cudev::TypesEquals::value'],['https://docs.opencv.org/4.2.0/df/dbf/structcv_1_1cudev_1_1TypesEquals_3_01A_00_01A_01_4.html#ae9504781c77143e391735a43d4d604aaa68d076eb36da583e1fcca53401c00449',1,'cv::cudev::TypesEquals< A, A >::value'],['https://docs.opencv.org/4.2.0/d7/d98/structcv_1_1datasets_1_1word.html#a4621a3aac9d8cac2706b67fad505d4ab',1,'cv::datasets::word::value'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a3fe7d5e5cdaa44962186c121c64e4495',1,'cv::util::optional::value()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a99838c47e5462b61fe9c5fea4080b4a2',1,'cv::util::optional::value() const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a0ede1a78ef553729dd33f039c1ed50f5',1,'cv::SparseMat::value(Node *n)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a39e257c6ec922968175136de3f572d2f',1,'cv::SparseMat::value(const Node *n) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a64d526ae50a7aceb49b2c5ba3528c859',1,'cv::SparseMat::value(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a50920170695fb08a34b4dbfd272b352d',1,'cv::SparseMat::value(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a34720d97d1db6e1f57ab229fddb5281f',1,'cv::SparseMat::value(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af112d88b293cd922392043fd57bb8398',1,'cv::SparseMat::value(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a64d526ae50a7aceb49b2c5ba3528c859',1,'cv::SparseMat::value(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a50920170695fb08a34b4dbfd272b352d',1,'cv::SparseMat::value(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a34720d97d1db6e1f57ab229fddb5281f',1,'cv::SparseMat::value(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af112d88b293cd922392043fd57bb8398',1,'cv::SparseMat::value(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a2abb15ac7188d500c245d79782302d3e',1,'cv::SparseMatConstIterator::value()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a3cb446f239d2e9486a251a7a65ffe2a0',1,'cv::SparseMatIterator::value()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a5b1afcb8b3cb7d323dfb6fc8db08310a',1,'regex_traits< _CharType >::value()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a5b1afcb8b3cb7d323dfb6fc8db08310a',1,'std::regex_traits::value()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8515f719046aa4851e385661f45595b0',1,'Eigen::DenseBase::value()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8515f719046aa4851e385661f45595b0',1,'DenseBase< ArrayWrapper< ExpressionType > >::value()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8515f719046aa4851e385661f45595b0',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::value()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8515f719046aa4851e385661f45595b0',1,'DenseBase< Solve< Decomposition, RhsType > >::value()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolValue.html#a8f87badf23a7d5e32145c9ea08aaa300',1,'Eigen::symbolic::SymbolValue::value()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Triplet.html#a003ea53c6559b106406f7916d6610547',1,'Eigen::Triplet::value()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a11641b35219676b225d9bd15c7677659.html#a11641b35219676b225d9bd15c7677659',1,'nlohmann::basic_json::value(const typename object_t::key_type &key, const ValueType &default_value) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_adcfdefe95d5c2471a5c97e911d46ee88.html#adcfdefe95d5c2471a5c97e911d46ee88',1,'nlohmann::basic_json::value(const typename object_t::key_type &key, const char *default_value) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a36bd6765ccd8aeeeb4e49a766ba639df.html#a36bd6765ccd8aeeeb4e49a766ba639df',1,'nlohmann::basic_json::value(const json_pointer &ptr, const ValueType &default_value) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4658a584571c4180656f5268969ed0a1.html#a4658a584571c4180656f5268969ed0a1',1,'nlohmann::basic_json::value(const json_pointer &ptr, const char *default_value) const']]], - ['value_20matrix_20decomposition_164',['Singular value matrix decomposition',['https://docs.opencv.org/4.2.0/dd/d2a/group__core__hal__interface__decomp__svd.html',1,'']]], - ['value_20to_20functions_165',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], - ['value_5fcomp_166',['value_comp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a2c51f439c6328b72ebdd7e5e558ef847',1,'std::map::value_comp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad55d763faac2fc4955a1885a5e140ad9',1,'std::multimap::value_comp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a4bb5cd2cb86e5c9867122556be6f850a',1,'std::multiset::value_comp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2fbb062a8014c9444365d2bedd0ced48',1,'std::set::value_comp() const']]], - ['value_5fcompare_167',['value_compare',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2d638b35695b151f99f992e5048cb58d',1,'std::set::value_compare'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2d638b35695b151f99f992e5048cb58d',1,'std::set::value_compare']]], - ['value_5fexpected_168',['VALUE_EXPECTED',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ab25ab28a95a47dd9cd9e26e71398dd3fa11b72f7c235089aebd2abdd72c0f7be9',1,'cv::FileStorage']]], - ['value_5fof_169',['value_of',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a751be733f70661205f6b72b2d8ca3215',1,'cv']]], - ['value_5for_170',['value_or',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a5508081ca60f545c5542b3c466dbd568',1,'cv::util::optional']]], - ['value_5ft_171',['value_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac68cb65a7f3517f0c5b1d3a4967406ad.html#ac68cb65a7f3517f0c5b1d3a4967406ad',1,'nlohmann::basic_json']]], - ['value_5ftype_172',['value_type',['https://docs.opencv.org/4.2.0/d0/d2a/structcv_1_1cudev_1_1AffineMapPtr.html#aec75c1d0483312c1f323a2028e461097',1,'cv::cudev::AffineMapPtr::value_type'],['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a3299f77b3cef8b0622ba4117a7f89397',1,'cv::Allocator::value_type'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#afbc953161e91d6455882c315eff66f6d',1,'cv::AutoBuffer::value_type'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#afbc953161e91d6455882c315eff66f6d',1,'AutoBuffer< double, 1 >::value_type'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#afbc953161e91d6455882c315eff66f6d',1,'AutoBuffer< int64, 1 >::value_type'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#afbc953161e91d6455882c315eff66f6d',1,'AutoBuffer< String, 1 >::value_type'],['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#ad35250650da7df491230e8d1af65b0ab',1,'cv::cudev::BinaryTransformPtr::value_type'],['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#acb4492481f0044cb0a7d3cec97ed991a',1,'cv::cudev::BrdBase::value_type'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#a41bf505b7bedd17feb6ea06276ccae96',1,'cv::cudev::BrdConstant::value_type'],['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#a9cd32f98f479f0858e8cc4134f2e2ba7',1,'cv::cudev::CommonAreaInterPtr::value_type'],['https://docs.opencv.org/4.2.0/d5/db7/structcv_1_1cudev_1_1ConstantPtr.html#a27e55fb1319bb388d7f717bf2c549233',1,'cv::cudev::ConstantPtr::value_type'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1CubicInterPtr.html#ae435b92dd939435fcebee3580bd381e3',1,'cv::cudev::CubicInterPtr::value_type'],['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1cudev_1_1DerivXPtr.html#a3d10843deccc0c1471089bfac1342c77',1,'cv::cudev::DerivXPtr::value_type'],['https://docs.opencv.org/4.2.0/dc/d51/structcv_1_1cudev_1_1DerivYPtr.html#adae698fbbebb794da7e2848597605502',1,'cv::cudev::DerivYPtr::value_type'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#a5a1e36ee5fbb8a7af614b324ed98d46c',1,'cv::cudev::GlobPtr::value_type'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#afbcc36a96b07356c66b64e23cc644a25',1,'cv::cudev::GpuMat_::value_type'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#a0f86a4f5dea3efaeca40190141f607cf',1,'cv::cudev::IntegerAreaInterPtr::value_type'],['https://docs.opencv.org/4.2.0/d0/de6/structcv_1_1cudev_1_1LaplacianPtr_3_011_00_01SrcPtr_01_4.html#a833fc2f542245d6cf2972aba9cc28c6e',1,'cv::cudev::LaplacianPtr< 1, SrcPtr >::value_type'],['https://docs.opencv.org/4.2.0/d4/d89/structcv_1_1cudev_1_1LaplacianPtr_3_013_00_01SrcPtr_01_4.html#abba0e932f412f2bd4c3073e7fcd473d0',1,'cv::cudev::LaplacianPtr< 3, SrcPtr >::value_type'],['https://docs.opencv.org/4.2.0/d7/d8a/structcv_1_1cudev_1_1LinearInterPtr.html#a5184dcc3b4d8cfaaad45ee635c7a398d',1,'cv::cudev::LinearInterPtr::value_type'],['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html#ac0af1df141d2e05a85960b72f014be5c',1,'cv::cudev::LutPtr::value_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a158a65c8a108736a88569d620456b0b1',1,'cv::Mat_::value_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a158a65c8a108736a88569d620456b0b1',1,'Mat_< double >::value_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a158a65c8a108736a88569d620456b0b1',1,'Mat_< float >::value_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a158a65c8a108736a88569d620456b0b1',1,'Mat_< uchar >::value_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a158a65c8a108736a88569d620456b0b1',1,'Mat_< unsigned char >::value_type'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a2fcc0be693f0ad52e028700abcfda159',1,'cv::MatConstIterator::value_type'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a266112c9e0fe894f48b98655f5fc96d4',1,'cv::MatConstIterator_::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'cv::Matx::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< _Tp, cn, 1 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, 1, 3 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, 2, 2 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, 2, 3 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, 3, 3 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, 3, 4 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, 4, 4 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, cn, 1 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< float, 2, 3 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< float, 3, 3 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< float, cn, 1 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< float_type, 4, 4 >::value_type'],['https://docs.opencv.org/4.2.0/d0/df5/structcv_1_1cudev_1_1NearestInterPtr.html#a4c37c1ede6163b8f4dbc383d82d1b640',1,'cv::cudev::NearestInterPtr::value_type'],['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a9573082d4c79f99f070e4f423ddd03e7',1,'cv::cudev::NormHamming::value_type'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#a3e665fa04957df1c22a7fc80da1f23c2',1,'cv::cudev::NormL1::value_type'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#ae2073255bd638f413ca84b3c012de9c2',1,'cv::cudev::NormL1< float >::value_type'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#a8caf670c16b4b8071c47fe2b055636f1',1,'cv::cudev::NormL2::value_type'],['https://docs.opencv.org/4.2.0/df/d20/structcv_1_1cudev_1_1PerspectiveMapPtr.html#afca28471100fa13ff7e13d643af00ce2',1,'cv::cudev::PerspectiveMapPtr::value_type'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a111f5f8f7368a1c738f4e5063473aa78',1,'cv::Point3_::value_type'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#ac81cd00bbdd5d66cf87e32654596160e',1,'cv::Point_::value_type'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#ac81cd00bbdd5d66cf87e32654596160e',1,'Point_< double >::value_type'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#ac81cd00bbdd5d66cf87e32654596160e',1,'Point_< float >::value_type'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#ac81cd00bbdd5d66cf87e32654596160e',1,'Point_< int >::value_type'],['https://docs.opencv.org/4.2.0/df/db4/structcv_1_1cudev_1_1PtrTraits_3_01Expr_3_01Body_01_4_01_4.html#a02d60371989229ec00014c5ce57a2487',1,'cv::cudev::PtrTraits< Expr< Body > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'cv::cudev::PtrTraitsBase::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< AffineMapPtrSz, AffineMapPtr >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op >, BinaryTransformPtr< Src1Ptr, Src2Ptr, Op > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< CommonAreaInterPtrSz< SrcPtr >, CommonAreaInterPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< ConstantPtrSz< T >, ConstantPtr< T > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< CubicInterPtrSz< SrcPtr >, CubicInterPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< DerivXPtrSz< SrcPtr >, DerivXPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< DerivYPtrSz< SrcPtr >, DerivYPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< GlobPtrSz< T >, GlobPtr< T > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< GpuMat_< T >, GlobPtr< T > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< IntegerAreaInterPtrSz< SrcPtr >, IntegerAreaInterPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< LaplacianPtrSz< ksize, SrcPtr >, LaplacianPtr< ksize, SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< LinearInterPtrSz< SrcPtr >, LinearInterPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< LutPtrSz< SrcPtr, TablePtr >, LutPtr< SrcPtr, TablePtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< NearestInterPtrSz< SrcPtr >, NearestInterPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< PerspectiveMapPtrSz, PerspectiveMapPtr >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< Ptr2DSz, Ptr2DSz >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< RemapPtr1Sz< SrcPtr, MapPtr >, RemapPtr1< SrcPtr, MapPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr >, RemapPtr2< SrcPtr, MapXPtr, MapYPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< ResizePtrSz< SrcPtr >, ResizePtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< ScharrXPtrSz< SrcPtr >, ScharrXPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< ScharrYPtrSz< SrcPtr >, ScharrYPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< SingleMaskChannelsSz< MaskPtr >, SingleMaskChannels< MaskPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< SobelXPtrSz< SrcPtr >, SobelXPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< SobelYPtrSz< SrcPtr >, SobelYPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< SrcPtr, SrcPtr >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< Texture< T >, TexturePtr< T > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< UnaryTransformPtrSz< SrcPtr, Op >, UnaryTransformPtr< SrcPtr, Op > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< ZipPtrSz< PtrTuple >, ZipPtr< PtrTuple > >::value_type'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a4cd2a47bea4cdc776e623625827a1601',1,'cv::Rect_::value_type'],['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html#a88ec7ab5b1e7a462e1e8487de0104f79',1,'cv::cudev::RemapPtr1::value_type'],['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#adfc1777dbf6296658a92d711bb777df2',1,'cv::cudev::RemapPtr2::value_type'],['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#aa680a99e8d80b04d63d178cdc88268fb',1,'cv::cudev::ResizePtr::value_type'],['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1ScharrXPtr.html#ad69afc6c315f9ae0fa93b25cfb7fefc5',1,'cv::cudev::ScharrXPtr::value_type'],['https://docs.opencv.org/4.2.0/d0/d70/structcv_1_1cudev_1_1ScharrYPtr.html#ae9fae41c0ee95a499dd46f7284ad4633',1,'cv::cudev::ScharrYPtr::value_type'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#aa4c3ef3ed9cb353439fcc4a6d17ee0a8',1,'cv::cudev::SingleMaskChannels::value_type'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a545d43b608de451311855c2ef808642d',1,'cv::Size_::value_type'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a545d43b608de451311855c2ef808642d',1,'Size_< float >::value_type'],['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1SobelXPtr.html#a8b0d69b3ee461ea3d19f9bdca8840eed',1,'cv::cudev::SobelXPtr::value_type'],['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1SobelYPtr.html#a993a97bd8004ad0aa2c33289cb72478c',1,'cv::cudev::SobelYPtr::value_type'],['https://docs.opencv.org/4.2.0/d2/d09/structcv_1_1cudev_1_1TexturePtr.html#a77a35e45462c33b161436ce97bf9a19d',1,'cv::cudev::TexturePtr::value_type'],['https://docs.opencv.org/4.2.0/dd/d01/structcv_1_1cudev_1_1UnaryTransformPtr.html#ac8e8dc328ddbf4fcc282621686e03851',1,'cv::cudev::UnaryTransformPtr::value_type'],['https://docs.opencv.org/4.2.0/d5/d9e/structcv_1_1V__TypeTraits_3_01double_01_4.html#aa986cfd9bb0e4d8d842f8d2d92558654',1,'cv::V_TypeTraits< double >::value_type'],['https://docs.opencv.org/4.2.0/da/d19/structcv_1_1V__TypeTraits_3_01float_01_4.html#a0fee3bee22d56ecb4a680759e357b81b',1,'cv::V_TypeTraits< float >::value_type'],['https://docs.opencv.org/4.2.0/db/d59/structcv_1_1V__TypeTraits_3_01int64_01_4.html#a58464c93b896dfd383b2f5ca5c9012d5',1,'cv::V_TypeTraits< int64 >::value_type'],['https://docs.opencv.org/4.2.0/d0/d9d/structcv_1_1V__TypeTraits_3_01schar_01_4.html#a7bb6e9ae632bd9ea32240462fe4c82ac',1,'cv::V_TypeTraits< schar >::value_type'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1V__TypeTraits_3_01short_01_4.html#aa3eb52b796d8660d9d0e8e253cffb1c0',1,'cv::V_TypeTraits< short >::value_type'],['https://docs.opencv.org/4.2.0/dd/d1d/structcv_1_1V__TypeTraits_3_01uchar_01_4.html#a2c9d07a8e6aa4f0df42675159fc0504d',1,'cv::V_TypeTraits< uchar >::value_type'],['https://docs.opencv.org/4.2.0/d2/d4d/structcv_1_1V__TypeTraits_3_01uint64_01_4.html#a3942c0cdb8cce596a0481909ad5e8748',1,'cv::V_TypeTraits< uint64 >::value_type'],['https://docs.opencv.org/4.2.0/d3/d8c/structcv_1_1V__TypeTraits_3_01unsigned_01_4.html#a8ae0daeb54f28771c3d2daa6e3dac7dc',1,'cv::V_TypeTraits< unsigned >::value_type'],['https://docs.opencv.org/4.2.0/d6/dd5/structcv_1_1V__TypeTraits_3_01ushort_01_4.html#a634b31d099dfb9255ab5df206a82dc54',1,'cv::V_TypeTraits< ushort >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'cv::Vec::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< _Tp, 4 >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< double, 2 >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< double, 3 >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< double, 4 >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< double, GPCPatchDescriptor::nFeatures >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< double, nFeatures >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< float, 2 >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< float, 3 >::value_type'],['https://docs.opencv.org/4.2.0/da/d2c/structcv_1_1cudev_1_1WithOutMask.html#a9c88bf9c3fc6a1b51844923df49eaeb2',1,'cv::cudev::WithOutMask::value_type'],['https://docs.opencv.org/4.2.0/dd/de4/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_01_4_01_4.html#a83b5330f7d39d66152e5fa61d58daa5c',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1 > >::value_type'],['https://docs.opencv.org/4.2.0/d4/dff/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_01_4_01_4.html#ae78111cfb7344ab266ac9bb5b952ccaf',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2 > >::value_type'],['https://docs.opencv.org/4.2.0/dd/d2b/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_00_01Ptr3_01_4_01_4.html#a14fb1050db5a36007640ba28b645caff',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2, Ptr3 > >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a67882de51ea972e066ed1ea5e39ae76c',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11631.html#ac8e3c7ff2237536b5567dc23b5218d38',1,'__gnu_pbds::detail::bin_search_tree_node_it_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#af7d6e44fa7c917f95357a470af816658',1,'__gnu_pbds::detail::binary_heap_const_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#af4eb9042a7175d970490ed0cdd89eda4',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#ad38e84193ee9d64e723d209b57d94656',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a0d64aeaf34a1aa7635345e4100c2da38',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#aa51dca0f6ab162918c10679e8feb57df',1,'allocator_traits< _Tp_alloc_type >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#a090d57c081a3e220bbe416e6b618f9f5',1,'const_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< input_iterator_tag, _CharT, _Traits::off_type, _CharT *, _CharT >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< input_iterator_tag, _Tp, _Dist, const _Tp *, const _Tp & >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< iterator_traits< _Iterator >::iterator_category, iterator_traits< _Iterator >::value_type, iterator_traits< _Iterator >::difference_type, iterator_traits< _Iterator >::pointer, iterator_traits< _Iterator >::reference >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< output_iterator_tag, void, void, void, void >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< std::output_iterator_tag, void, void, void, void >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< std::random_access_iterator_tag, _CharT >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< std::random_access_iterator_tag, bool >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a68da9e97879135d05aa37f27e2c826c4',1,'iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a6b4407e8d88685be7370f32a7f8046ba',1,'point_const_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#aa45ff42c6115d26f80c83e5a20ba4485',1,'point_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#aa51dca0f6ab162918c10679e8feb57df',1,'std::allocator_traits::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a714ab1320373db07c7999b4f98bae091',1,'std::allocator_traits< allocator< _Tp > >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::back_insert_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a2c87f5c1ef86cd0a4b1ea60205b50924',1,'std::complex::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::front_insert_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::insert_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::istream_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::istreambuf_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::ostream_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::ostreambuf_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::raw_storage_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::reverse_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3e752147bbbb2d617e85d6a9f15cd57b',1,'std::set::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3e752147bbbb2d617e85d6a9f15cd57b',1,'std::set::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af7e7d39b4a188c7aa535d0431ae8f14c',1,'std::unordered_map::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af7e7d39b4a188c7aa535d0431ae8f14c',1,'std::unordered_map::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a4baa45433c393ecfab2c784b8de381e8',1,'std::unordered_multimap::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a4baa45433c393ecfab2c784b8de381e8',1,'std::unordered_multimap::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a3b9af18ceb55369b7be262668119ff8c',1,'std::unordered_multiset::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a3b9af18ceb55369b7be262668119ff8c',1,'std::unordered_multiset::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a14e45fe3da6c5bb759688d5aed9183ff',1,'std::unordered_set::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a14e45fe3da6c5bb759688d5aed9183ff',1,'std::unordered_set::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af7e7d39b4a188c7aa535d0431ae8f14c',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af7e7d39b4a188c7aa535d0431ae8f14c',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9276182dab8236c33f1e7abf491d504d',1,'Eigen::DenseBase::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9276182dab8236c33f1e7abf491d504d',1,'DenseBase< ArrayWrapper< ExpressionType > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9276182dab8236c33f1e7abf491d504d',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9276182dab8236c33f1e7abf491d504d',1,'DenseBase< Solve< Decomposition, RhsType > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac254d3b61718ebc2136d27bac043dcb7',1,'Eigen::SparseMatrixBase::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac254d3b61718ebc2136d27bac043dcb7',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac254d3b61718ebc2136d27bac043dcb7',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac254d3b61718ebc2136d27bac043dcb7',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac254d3b61718ebc2136d27bac043dcb7',1,'SparseMatrixBase< Transpose< MatrixType > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac254d3b61718ebc2136d27bac043dcb7',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::value_type'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a57c816a20c1d3ccc9bbc2972829da847.html#a57c816a20c1d3ccc9bbc2972829da847',1,'nlohmann::basic_json::value_type']]], - ['valueoffset_173',['valueOffset',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#a6b09668278ec34c931b93d6f7bb1547c',1,'cv::SparseMat::Hdr']]], - ['valueptr_174',['valuePtr',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'Eigen::SparseCompressedBase::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'Eigen::SparseCompressedBase::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< Derived >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< Derived >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< Transpose< MatrixType > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< Transpose< MatrixType > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a574ea9371c22eabebdda21c0787312dc',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html#af91648a18729ae8ff29cb1d8751c5655',1,'Eigen::SparseMapBase< Derived, WriteAccessors >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2684952b14b5c9b0f68ae3bb8c517a6',1,'Eigen::SparseMatrix::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9d4354d3f4d121d764bbed33cac05329',1,'Eigen::SparseMatrix::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2684952b14b5c9b0f68ae3bb8c517a6',1,'SparseMatrix< Scalar >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9d4354d3f4d121d764bbed33cac05329',1,'SparseMatrix< Scalar >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2684952b14b5c9b0f68ae3bb8c517a6',1,'SparseMatrix< Scalar, ColMajor, int >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9d4354d3f4d121d764bbed33cac05329',1,'SparseMatrix< Scalar, ColMajor, int >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2684952b14b5c9b0f68ae3bb8c517a6',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9d4354d3f4d121d764bbed33cac05329',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2684952b14b5c9b0f68ae3bb8c517a6',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9d4354d3f4d121d764bbed33cac05329',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::valuePtr() const']]], - ['values_175',['Optional values',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html',1,'']]], - ['valuetype_176',['ValueType',['https://docs.opencv.org/4.2.0/d3/d59/structcv_1_1Hamming.html#ad95bdbcd7f1e66f2ac76168a75475976',1,'cv::Hamming::ValueType'],['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1L1.html#a03e450655ea3ca64f331f9296b510637',1,'cv::L1::ValueType'],['https://docs.opencv.org/4.2.0/dc/daa/structcv_1_1L2.html#ad25afc9e28cdb4d9dfde1a7b6feafd08',1,'cv::L2::ValueType'],['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html#ad09e5e995b1da2bb0ac47dea18e3fb5b',1,'cv::SL2::ValueType']]], - ['var_5fcategorical_177',['VAR_CATEGORICAL',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggafd82a0e568907b8680027cb246a6eb06aa27f7cc3f72af77e1c2b39f5d91db078',1,'cv::ml::VAR_CATEGORICAL'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggafd82a0e568907b8680027cb246a6eb06aa27f7cc3f72af77e1c2b39f5d91db078',1,'VAR_CATEGORICAL(Global Namespace)']]], - ['var_5fnumerical_178',['VAR_NUMERICAL',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggafd82a0e568907b8680027cb246a6eb06ae94fb869759383fce5f02a63b4666a3f',1,'cv::ml::VAR_NUMERICAL'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggafd82a0e568907b8680027cb246a6eb06ae94fb869759383fce5f02a63b4666a3f',1,'VAR_NUMERICAL(Global Namespace)']]], - ['var_5fordered_179',['VAR_ORDERED',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggafd82a0e568907b8680027cb246a6eb06a077b19eb913ac28b0a7ca765943cd188',1,'cv::ml::VAR_ORDERED'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggafd82a0e568907b8680027cb246a6eb06a077b19eb913ac28b0a7ca765943cd188',1,'VAR_ORDERED(Global Namespace)']]], - ['variables_180',['Condition Variables',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html',1,'']]], - ['variabletypes_181',['VariableTypes',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gafd82a0e568907b8680027cb246a6eb06',1,'cv::ml::VariableTypes'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gafd82a0e568907b8680027cb246a6eb06',1,'VariableTypes(Global Namespace)']]], - ['variant_182',['variant',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html',1,'cv::util::variant< Ts >'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a204de4b74e5394c354ee97bfd1b2a320',1,'cv::util::variant::variant() noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a7eded4ad52972cb36fe84b6d3430d3f1',1,'cv::util::variant::variant(const variant &other)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a07d8a0b9c7bbce035cdd045fd9ac3aec',1,'cv::util::variant::variant(variant &&other) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#aa0c548f7b131f3fd2056f8cfb1727c90',1,'cv::util::variant::variant(const T &t)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ae6a7772dd43b6fa1b7bb53d7b8ede17a',1,'cv::util::variant::variant(T &&t, typename detail::are_different< variant, T, int >::type=0)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a204de4b74e5394c354ee97bfd1b2a320',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::variant() noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a7eded4ad52972cb36fe84b6d3430d3f1',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::variant(const variant &other)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a07d8a0b9c7bbce035cdd045fd9ac3aec',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::variant(variant &&other) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#aa0c548f7b131f3fd2056f8cfb1727c90',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::variant(const T &t)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ae6a7772dd43b6fa1b7bb53d7b8ede17a',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::variant(T &&t, typename detail::are_different< variant, T, int >::type=0)']]], - ['variant_2ehpp_183',['variant.hpp',['https://docs.opencv.org/4.2.0/d9/d7a/variant_8hpp.html',1,'']]], - ['variant_3c_20cv_3a_3autil_3a_3amonostate_2c_20ro_5fext_5ft_2c_20rw_5fext_5ft_2c_20rw_5fown_5ft_20_3e_184',['variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html',1,'']]], - ['variant_3c_20nothing_2c_20t_20_3e_185',['variant< nothing, T >',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html',1,'']]], - ['variationalrefinement_186',['VariationalRefinement',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html',1,'cv']]], - ['varidx_187',['varIdx',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#a82c0fe26489dc99a4e560a7b97c3ecef',1,'cv::ml::DTrees::Split']]], - ['vavg2_188',['vavg2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8635d8429a01073075a189e45472637b',1,'cv::cudev::vavg2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8635d8429a01073075a189e45472637b',1,'vavg2()(Global Namespace)']]], - ['vavg4_189',['vavg4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26fe1ab7bbf8d42d15778c4a33942c25',1,'cv::cudev::vavg4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26fe1ab7bbf8d42d15778c4a33942c25',1,'vavg4()(Global Namespace)']]], - ['vavrg2_190',['vavrg2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d65e10ea4aadee07d6bf64a5cd124b6',1,'cv::cudev::vavrg2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d65e10ea4aadee07d6bf64a5cd124b6',1,'vavrg2()(Global Namespace)']]], - ['vavrg4_191',['vavrg4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4db95f1f4957d445cf44f3b971696012',1,'cv::cudev::vavrg4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4db95f1f4957d445cf44f3b971696012',1,'vavrg4()(Global Namespace)']]], - ['vc1_192',['VC1',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146ad8aeb35f84f90985490476b6b305d70f',1,'cv::cudacodec::VC1'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146ad8aeb35f84f90985490476b6b305d70f',1,'VC1(Global Namespace)']]], - ['vcmpeq2_193',['vcmpeq2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad69622fde93f93e51bfb9d003457035',1,'cv::cudev::vcmpeq2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad69622fde93f93e51bfb9d003457035',1,'vcmpeq2()(Global Namespace)']]], - ['vcmpeq4_194',['vcmpeq4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490f2147e0f52fde56eee6ef068bdc2a',1,'cv::cudev::vcmpeq4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490f2147e0f52fde56eee6ef068bdc2a',1,'vcmpeq4()(Global Namespace)']]], - ['vcmpge2_195',['vcmpge2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43512196d41f198a5c6f08c903fc7dac',1,'cv::cudev::vcmpge2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43512196d41f198a5c6f08c903fc7dac',1,'vcmpge2()(Global Namespace)']]], - ['vcmpge4_196',['vcmpge4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07ed1834e5be35f07abcad584c884655',1,'cv::cudev::vcmpge4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07ed1834e5be35f07abcad584c884655',1,'vcmpge4()(Global Namespace)']]], - ['vcmpgt2_197',['vcmpgt2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8976e5ab34ccd5fcd500205a3bb718bb',1,'cv::cudev::vcmpgt2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8976e5ab34ccd5fcd500205a3bb718bb',1,'vcmpgt2()(Global Namespace)']]], - ['vcmpgt4_198',['vcmpgt4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga689437dbed283333a8edfcce80ae0b64',1,'cv::cudev::vcmpgt4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga689437dbed283333a8edfcce80ae0b64',1,'vcmpgt4()(Global Namespace)']]], - ['vcmple2_199',['vcmple2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe0f777d27b15696ae3e859268113048',1,'cv::cudev::vcmple2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe0f777d27b15696ae3e859268113048',1,'vcmple2()(Global Namespace)']]], - ['vcmple4_200',['vcmple4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be660977cb33535a020c1b453702360',1,'cv::cudev::vcmple4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be660977cb33535a020c1b453702360',1,'vcmple4()(Global Namespace)']]], - ['vcmplt2_201',['vcmplt2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5d86d0b05c3913ae727bde6cf762969',1,'cv::cudev::vcmplt2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5d86d0b05c3913ae727bde6cf762969',1,'vcmplt2()(Global Namespace)']]], - ['vcmplt4_202',['vcmplt4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b3085d21f688f9735e3ddea0b39b600',1,'cv::cudev::vcmplt4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b3085d21f688f9735e3ddea0b39b600',1,'vcmplt4()(Global Namespace)']]], - ['vcmpne2_203',['vcmpne2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafec1064313a526d42093e9970dc6fe4',1,'cv::cudev::vcmpne2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafec1064313a526d42093e9970dc6fe4',1,'vcmpne2()(Global Namespace)']]], - ['vcmpne4_204',['vcmpne4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga313926d4ce24905c750d65a00f4de0ac',1,'cv::cudev::vcmpne4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga313926d4ce24905c750d65a00f4de0ac',1,'vcmpne4()(Global Namespace)']]], - ['vconcat_205',['vconcat',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga744f53b69f6e4f12156cdde4e76aed27',1,'cv::vconcat(const Mat *src, size_t nsrc, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaad07cede730cdde64b90e987aad179b8',1,'cv::vconcat(InputArray src1, InputArray src2, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga558e169e15adcc46b8cdcc6cd215070f',1,'cv::vconcat(InputArrayOfArrays src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga744f53b69f6e4f12156cdde4e76aed27',1,'vconcat(const Mat *src, size_t nsrc, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaad07cede730cdde64b90e987aad179b8',1,'vconcat(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga558e169e15adcc46b8cdcc6cd215070f',1,'vconcat(InputArrayOfArrays src, OutputArray dst)(Global Namespace)']]], - ['vec_206',['Vec',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv']]], - ['vec_207',['vec',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'Eigen::QuaternionBase::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'Eigen::QuaternionBase::vec() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::vec() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::vec() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::vec() const'],['../structkinematics_1_1gearpos__t.html#a9389e03d0ec896769bbe7bf3e2673a26',1,'kinematics::gearpos_t::vec()'],['../structkinematics_1_1jointpos__t.html#a1c3501bdc6b433d9aec164be2467b80b',1,'kinematics::jointpos_t::vec()']]], - ['vec_208',['Vec',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'cv::Vec::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'cv::Vec::Vec(_Tp v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'cv::Vec::Vec(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'cv::Vec::Vec(const _Tp *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'cv::Vec::Vec(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'cv::Vec::Vec(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'cv::Vec::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'cv::Vec::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'cv::Vec::Vec(const Matx< _Tp, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< _Tp, 4 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< _Tp, 4 >::Vec(_Tp v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< _Tp, 4 >::Vec(const _Tp *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< _Tp, 4 >::Vec(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< _Tp, 4 >::Vec(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< _Tp, 4 >::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< _Tp, 4 >::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< _Tp, 4 >::Vec(const Matx< _Tp, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, 2 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, 2 >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, 2 >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, 2 >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, 2 >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, 2 >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, 2 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, 2 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, 2 >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, 3 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, 3 >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, 3 >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, 3 >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, 3 >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, 3 >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, 3 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, 3 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, 3 >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, 4 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, 4 >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, 4 >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, 4 >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, 4 >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, 4 >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, 4 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, 4 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, 4 >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, nFeatures >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, nFeatures >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, nFeatures >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, nFeatures >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, nFeatures >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, nFeatures >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, nFeatures >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< float, 2 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< float, 2 >::Vec(float v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< float, 2 >::Vec(float v0, float v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< float, 2 >::Vec(const float *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< float, 2 >::Vec(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< float, 2 >::Vec(const Vec< float, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< float, 2 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< float, 2 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< float, 2 >::Vec(const Matx< float, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< float, 3 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< float, 3 >::Vec(float v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< float, 3 >::Vec(float v0, float v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< float, 3 >::Vec(const float *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< float, 3 >::Vec(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< float, 3 >::Vec(const Vec< float, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< float, 3 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< float, 3 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< float, 3 >::Vec(const Matx< float, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)']]], + ['va_20interoperability_141',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], + ['va_5fintel_2ehpp_142',['va_intel.hpp',['https://docs.opencv.org/4.2.0/d5/d8c/va__intel_8hpp.html',1,'']]], + ['vabsdiff2_143',['vabsdiff2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga198b2bfcacae3cbe61938bce671432ba',1,'cv::cudev::vabsdiff2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga198b2bfcacae3cbe61938bce671432ba',1,'vabsdiff2()(Global Namespace)']]], + ['vabsdiff4_144',['vabsdiff4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf86631ff00cb9e7cf5e60a0fcb23743d',1,'cv::cudev::vabsdiff4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf86631ff00cb9e7cf5e60a0fcb23743d',1,'vabsdiff4()(Global Namespace)']]], + ['vadd2_145',['vadd2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31016a43f185b5436a6057046b3a87e2',1,'cv::cudev::vadd2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31016a43f185b5436a6057046b3a87e2',1,'vadd2()(Global Namespace)']]], + ['vadd4_146',['vadd4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ba46e5d618d1b3a265053fb66695daa',1,'cv::cudev::vadd4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ba46e5d618d1b3a265053fb66695daa',1,'vadd4()(Global Namespace)']]], + ['val_147',['val',['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#ab0a675854cec81a16e4b3e8c724d3b95',1,'cv::cudev::BrdConstant::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'cv::Matx::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< _Tp, cn, 1 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, 1, 3 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, 2, 2 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, 2, 3 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, 3, 3 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, 3, 4 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, 4, 4 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< double, cn, 1 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< float, 2, 3 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< float, 3, 3 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< float, cn, 1 >::val'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afa9ad3bc5b09ebcdfc6f98f44c15191d',1,'Matx< float_type, 4, 4 >::val'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#afb83970cca5d285744f915c60aee281a',1,'cv::gapi::own::Scalar::val']]], + ['valarray_148',['valarray',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04647.html',1,'std::valarray< _Tp >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00179.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga86cb8edd85b0f415ff434169746203b8',1,'std::valarray::valarray()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga97d87db7cf732f6df07a4bc214ab1b6c',1,'std::valarray::valarray(size_t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa3081177498d05f233dc919b723ac7ca',1,'std::valarray::valarray(const _Tp &, size_t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04647.html#a1ec188c5bae0bf1ee212da704cc1dc7a',1,'std::valarray::valarray(const _Tp *__restrict__, size_t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa097c18bfb82fa18eb77d561e3f3220d',1,'std::valarray::valarray(const valarray &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gacaf590f7e44f9aa8d247c026f2c6685a',1,'std::valarray::valarray(valarray &&) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa67c616cc84294b4ecfe9492e673e937',1,'std::valarray::valarray(const slice_array< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41d41b2154090e3aa77b2a8c8c1eafe2',1,'std::valarray::valarray(const gslice_array< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga341e360faf03730a2ad4ddb98bb84caa',1,'std::valarray::valarray(const mask_array< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4440404083086817b9e50ddecfa604fb',1,'std::valarray::valarray(const indirect_array< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa0445cb9da95df6871ea1c2b625aedf7',1,'std::valarray::valarray(initializer_list< _Tp >)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga86cb8edd85b0f415ff434169746203b8',1,'valarray< size_t >::valarray()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga97d87db7cf732f6df07a4bc214ab1b6c',1,'valarray< size_t >::valarray(size_t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa3081177498d05f233dc919b723ac7ca',1,'valarray< size_t >::valarray(const size_t &, size_t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04647.html#a1ec188c5bae0bf1ee212da704cc1dc7a',1,'valarray< size_t >::valarray(const size_t *__restrict__, size_t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa097c18bfb82fa18eb77d561e3f3220d',1,'valarray< size_t >::valarray(const valarray &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gacaf590f7e44f9aa8d247c026f2c6685a',1,'valarray< size_t >::valarray(valarray &&) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa67c616cc84294b4ecfe9492e673e937',1,'valarray< size_t >::valarray(const slice_array< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41d41b2154090e3aa77b2a8c8c1eafe2',1,'valarray< size_t >::valarray(const gslice_array< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga341e360faf03730a2ad4ddb98bb84caa',1,'valarray< size_t >::valarray(const mask_array< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4440404083086817b9e50ddecfa604fb',1,'valarray< size_t >::valarray(const indirect_array< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa0445cb9da95df6871ea1c2b625aedf7',1,'valarray< size_t >::valarray(initializer_list< size_t >)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga86cb8edd85b0f415ff434169746203b8',1,'valarray()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga97d87db7cf732f6df07a4bc214ab1b6c',1,'valarray(size_t)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa3081177498d05f233dc919b723ac7ca',1,'valarray(const _Tp &, size_t)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa097c18bfb82fa18eb77d561e3f3220d',1,'valarray(const valarray &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gacaf590f7e44f9aa8d247c026f2c6685a',1,'valarray(valarray &&) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa67c616cc84294b4ecfe9492e673e937',1,'valarray(const slice_array< _Tp > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41d41b2154090e3aa77b2a8c8c1eafe2',1,'valarray(const gslice_array< _Tp > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga341e360faf03730a2ad4ddb98bb84caa',1,'valarray(const mask_array< _Tp > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4440404083086817b9e50ddecfa604fb',1,'valarray(const indirect_array< _Tp > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa0445cb9da95df6871ea1c2b625aedf7',1,'valarray(initializer_list< _Tp >)(Global Namespace)']]], + ['valarray_3c_20size_5ft_20_3e_149',['valarray< size_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04647.html',1,'']]], + ['valarray_5fafter_2eh_150',['valarray_after.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00638.html',1,'']]], + ['valarray_5farray_2eh_151',['valarray_array.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00641.html',1,'']]], + ['valarray_5farray_2etcc_152',['valarray_array.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00644.html',1,'']]], + ['valarray_5fbefore_2eh_153',['valarray_before.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00647.html',1,'']]], + ['valid_154',['valid',['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a309514ce0d50e1529054d6f7e9cc23e2',1,'cv::AsyncArray']]], + ['valid_5fprefix_155',['valid_prefix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a02d5021b34020bc97aeb4ea618a92740',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::valid_prefix()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a02d5021b34020bc97aeb4ea618a92740',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::valid_prefix()']]], + ['valid_5fsize_156',['valid_size',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#aa6ca25bbf560a854e6eea010a89980e8',1,'OpenCV_API_Header']]], + ['validate_157',['validate',['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a8f53e513ca5a22ea0ecd896551c59664',1,'cv::detail::tracked_cv_mat::validate()'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a907c4700b70270adce7d25228e2e3ee5',1,'cv::detail::tracked_cv_umat::validate()']]], + ['validatedisparity_158',['validateDisparity',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga214b498b8d01d0417e0d08be64c54eb5',1,'cv::validateDisparity()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga214b498b8d01d0417e0d08be64c54eb5',1,'validateDisparity()(Global Namespace)']]], + ['validatekey_159',['validateKey',['../namespaceutil.html#acabe627a0fcfdd21b5170e4108c90c0b',1,'util::validateKey(const json &j, const std::string &key, const val_t &type)'],['../namespaceutil.html#a02c736fa7ad5a68e89f3f56be0235aff',1,'util::validateKey(const json &j, const std::string &key, const std::unordered_set< val_t > &types)']]], + ['validateoneof_160',['validateOneOf',['../namespaceutil.html#a222e14af5a8aee85361adc9670ce33b6',1,'util']]], + ['validaterange_161',['validateRange',['../namespaceutil.html#aa54731506a7b3ae7300a6937b59809d4',1,'util']]], + ['validation_162',['validation',['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html#af063eb99c4cf7d07cc5f642d9e6f1d7c',1,'cv::datasets::Dataset']]], + ['validgeometry_163',['validGeometry',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a98184e52f16c9b6ab80102bf29e910ec',1,'cv::Subdiv2D']]], + ['value_164',['value',['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html#a86df3b107a9d56e5f082ad9958f7d780',1,'cv::gapi::fluid::Border::value'],['https://docs.opencv.org/4.2.0/d6/dea/structcv_1_1detail_1_1callCustomGetBorder_3_01false_00_01Impl_01_4.html#ae74a09c3b3a8668fc8ab6b474be80b99',1,'cv::detail::callCustomGetBorder< false, Impl >::value'],['https://docs.opencv.org/4.2.0/d0/df2/structcv_1_1detail_1_1callCustomGetBorder_3_01true_00_01Impl_01_4.html#a07b8f3fffc221bc4b03fe2ee9b4ecec5',1,'cv::detail::callCustomGetBorder< true, Impl >::value'],['https://docs.opencv.org/4.2.0/d5/db7/structcv_1_1cudev_1_1ConstantPtr.html#aa5ce9b10fe30e8cf58117e9fcb430c8c',1,'cv::cudev::ConstantPtr::value'],['https://docs.opencv.org/4.2.0/d7/d0e/classcv_1_1DataDepth.html#a022386121e1e1241c5a999976d4b5956a7cb026110dca902585250642b85975d2',1,'cv::DataDepth::value'],['https://docs.opencv.org/4.2.0/d7/de1/classcv_1_1GArg.html#a1fcca49bc463558adaf3c62a7901ea94',1,'cv::GArg::value'],['https://docs.opencv.org/4.2.0/d3/dc8/structcv_1_1detail_1_1has__custom__wrap.html#ab3fedf93af8c8ba3495e3c14a75e100b',1,'cv::detail::has_custom_wrap::value'],['https://docs.opencv.org/4.2.0/d7/d1b/structcv_1_1detail_1_1has__Window.html#a003774e3ed8c680311caabf6b992d61f',1,'cv::detail::has_Window::value'],['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1cudev_1_1Int2Type.html#a8190711d0975b6d7d4b0e4e28536a7ffa30c67650242d5b240a90a7b989f03d16',1,'cv::cudev::Int2Type::value'],['https://docs.opencv.org/4.2.0/d9/dc3/structcv_1_1detail_1_1is__gmat__type.html#ae4a31fcdc3052f93ca55b848781bfdee',1,'cv::detail::is_gmat_type::value'],['https://docs.opencv.org/4.2.0/d1/de5/structcv_1_1cudev_1_1IsBinaryFunction.html#a970115452365e0902a36d496dab77ba7a90ad3b693ab1636982b2edc8890cb66f',1,'cv::cudev::IsBinaryFunction::value'],['https://docs.opencv.org/4.2.0/da/db4/structcv_1_1cudev_1_1IsPowerOf2.html#aa22c7b4dd3eafae98cb8428c852ef0adab32ea8ad86d2766541dbd8c20e29a9a6',1,'cv::cudev::IsPowerOf2::value'],['https://docs.opencv.org/4.2.0/d6/d82/structcv_1_1cudev_1_1IsUnaryFunction.html#a8ca9358fed14af43e87169ce69752eeea15389267bc101f4e4513f9be55c7a7bc',1,'cv::cudev::IsUnaryFunction::value'],['https://docs.opencv.org/4.2.0/d5/da6/structcv_1_1cudev_1_1Log2.html#aefde90de9934423b33c85769743c69caaf61f084c4b5cf2f65f4992b5ce3955c9',1,'cv::cudev::Log2::value'],['https://docs.opencv.org/4.2.0/d5/d16/structcv_1_1cudev_1_1Log2_3_01N_00_010_00_01COUNT_01_4.html#a43aa769f98bae02aa98c16877257175cac667b581a71abad6bb3069a8626160d4',1,'cv::cudev::Log2< N, 0, COUNT >::value'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#a93181d806c875eece1a13fd8ef9effa8',1,'cv::ml::DTrees::Node::value'],['https://docs.opencv.org/4.2.0/d3/d02/structcv_1_1datasets_1_1tag.html#aeb3f78239d7f8de2707e61590152264c',1,'cv::datasets::tag::value'],['https://docs.opencv.org/4.2.0/d4/d46/structcv_1_1util_1_1type__list__index.html#a15e82da10a9fbccdd671016177e3a640',1,'cv::util::type_list_index::value'],['https://docs.opencv.org/4.2.0/d1/d34/structcv_1_1util_1_1detail_1_1type__list__index__helper.html#ab4c129e6038154e7d8bd1cc3fcfd2991',1,'cv::util::detail::type_list_index_helper::value'],['https://docs.opencv.org/4.2.0/df/dfa/structcv_1_1util_1_1detail_1_1type__list__index__helper_3_01I_00_01Target_00_01First_01_4.html#a653e06ea12093d1eb70f79066e5cb5c7',1,'cv::util::detail::type_list_index_helper< I, Target, First >::value'],['https://docs.opencv.org/4.2.0/df/d71/structcv_1_1cudev_1_1TypesEquals.html#a52c3addfcc794233b5b9569a4f374cada00d77df089f100b5179bb3ad3e4c412b',1,'cv::cudev::TypesEquals::value'],['https://docs.opencv.org/4.2.0/df/dbf/structcv_1_1cudev_1_1TypesEquals_3_01A_00_01A_01_4.html#ae9504781c77143e391735a43d4d604aaa68d076eb36da583e1fcca53401c00449',1,'cv::cudev::TypesEquals< A, A >::value'],['https://docs.opencv.org/4.2.0/d7/d98/structcv_1_1datasets_1_1word.html#a4621a3aac9d8cac2706b67fad505d4ab',1,'cv::datasets::word::value'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a3fe7d5e5cdaa44962186c121c64e4495',1,'cv::util::optional::value()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a99838c47e5462b61fe9c5fea4080b4a2',1,'cv::util::optional::value() const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a0ede1a78ef553729dd33f039c1ed50f5',1,'cv::SparseMat::value(Node *n)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a39e257c6ec922968175136de3f572d2f',1,'cv::SparseMat::value(const Node *n) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a64d526ae50a7aceb49b2c5ba3528c859',1,'cv::SparseMat::value(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a50920170695fb08a34b4dbfd272b352d',1,'cv::SparseMat::value(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a34720d97d1db6e1f57ab229fddb5281f',1,'cv::SparseMat::value(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af112d88b293cd922392043fd57bb8398',1,'cv::SparseMat::value(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a64d526ae50a7aceb49b2c5ba3528c859',1,'cv::SparseMat::value(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a50920170695fb08a34b4dbfd272b352d',1,'cv::SparseMat::value(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a34720d97d1db6e1f57ab229fddb5281f',1,'cv::SparseMat::value(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af112d88b293cd922392043fd57bb8398',1,'cv::SparseMat::value(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a2abb15ac7188d500c245d79782302d3e',1,'cv::SparseMatConstIterator::value()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a3cb446f239d2e9486a251a7a65ffe2a0',1,'cv::SparseMatIterator::value()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a5b1afcb8b3cb7d323dfb6fc8db08310a',1,'regex_traits< _CharType >::value()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a5b1afcb8b3cb7d323dfb6fc8db08310a',1,'std::regex_traits::value()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8515f719046aa4851e385661f45595b0',1,'Eigen::DenseBase::value()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8515f719046aa4851e385661f45595b0',1,'DenseBase< ArrayWrapper< ExpressionType > >::value()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8515f719046aa4851e385661f45595b0',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::value()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a8515f719046aa4851e385661f45595b0',1,'DenseBase< Solve< Decomposition, RhsType > >::value()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolValue.html#a8f87badf23a7d5e32145c9ea08aaa300',1,'Eigen::symbolic::SymbolValue::value()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Triplet.html#a003ea53c6559b106406f7916d6610547',1,'Eigen::Triplet::value()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a11641b35219676b225d9bd15c7677659.html#a11641b35219676b225d9bd15c7677659',1,'nlohmann::basic_json::value(const typename object_t::key_type &key, const ValueType &default_value) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_adcfdefe95d5c2471a5c97e911d46ee88.html#adcfdefe95d5c2471a5c97e911d46ee88',1,'nlohmann::basic_json::value(const typename object_t::key_type &key, const char *default_value) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a36bd6765ccd8aeeeb4e49a766ba639df.html#a36bd6765ccd8aeeeb4e49a766ba639df',1,'nlohmann::basic_json::value(const json_pointer &ptr, const ValueType &default_value) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4658a584571c4180656f5268969ed0a1.html#a4658a584571c4180656f5268969ed0a1',1,'nlohmann::basic_json::value(const json_pointer &ptr, const char *default_value) const']]], + ['value_20matrix_20decomposition_165',['Singular value matrix decomposition',['https://docs.opencv.org/4.2.0/dd/d2a/group__core__hal__interface__decomp__svd.html',1,'']]], + ['value_20to_20functions_166',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], + ['value_5fcomp_167',['value_comp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a2c51f439c6328b72ebdd7e5e558ef847',1,'std::map::value_comp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad55d763faac2fc4955a1885a5e140ad9',1,'std::multimap::value_comp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a4bb5cd2cb86e5c9867122556be6f850a',1,'std::multiset::value_comp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2fbb062a8014c9444365d2bedd0ced48',1,'std::set::value_comp() const']]], + ['value_5fcompare_168',['value_compare',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2d638b35695b151f99f992e5048cb58d',1,'std::set::value_compare'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2d638b35695b151f99f992e5048cb58d',1,'std::set::value_compare']]], + ['value_5fexpected_169',['VALUE_EXPECTED',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ab25ab28a95a47dd9cd9e26e71398dd3fa11b72f7c235089aebd2abdd72c0f7be9',1,'cv::FileStorage']]], + ['value_5fof_170',['value_of',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a751be733f70661205f6b72b2d8ca3215',1,'cv']]], + ['value_5for_171',['value_or',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a5508081ca60f545c5542b3c466dbd568',1,'cv::util::optional']]], + ['value_5ft_172',['value_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac68cb65a7f3517f0c5b1d3a4967406ad.html#ac68cb65a7f3517f0c5b1d3a4967406ad',1,'nlohmann::basic_json']]], + ['value_5ftype_173',['value_type',['https://docs.opencv.org/4.2.0/d0/d2a/structcv_1_1cudev_1_1AffineMapPtr.html#aec75c1d0483312c1f323a2028e461097',1,'cv::cudev::AffineMapPtr::value_type'],['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a3299f77b3cef8b0622ba4117a7f89397',1,'cv::Allocator::value_type'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#afbc953161e91d6455882c315eff66f6d',1,'cv::AutoBuffer::value_type'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#afbc953161e91d6455882c315eff66f6d',1,'AutoBuffer< double, 1 >::value_type'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#afbc953161e91d6455882c315eff66f6d',1,'AutoBuffer< int64, 1 >::value_type'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#afbc953161e91d6455882c315eff66f6d',1,'AutoBuffer< String, 1 >::value_type'],['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#ad35250650da7df491230e8d1af65b0ab',1,'cv::cudev::BinaryTransformPtr::value_type'],['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#acb4492481f0044cb0a7d3cec97ed991a',1,'cv::cudev::BrdBase::value_type'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#a41bf505b7bedd17feb6ea06276ccae96',1,'cv::cudev::BrdConstant::value_type'],['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#a9cd32f98f479f0858e8cc4134f2e2ba7',1,'cv::cudev::CommonAreaInterPtr::value_type'],['https://docs.opencv.org/4.2.0/d5/db7/structcv_1_1cudev_1_1ConstantPtr.html#a27e55fb1319bb388d7f717bf2c549233',1,'cv::cudev::ConstantPtr::value_type'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1CubicInterPtr.html#ae435b92dd939435fcebee3580bd381e3',1,'cv::cudev::CubicInterPtr::value_type'],['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1cudev_1_1DerivXPtr.html#a3d10843deccc0c1471089bfac1342c77',1,'cv::cudev::DerivXPtr::value_type'],['https://docs.opencv.org/4.2.0/dc/d51/structcv_1_1cudev_1_1DerivYPtr.html#adae698fbbebb794da7e2848597605502',1,'cv::cudev::DerivYPtr::value_type'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#a5a1e36ee5fbb8a7af614b324ed98d46c',1,'cv::cudev::GlobPtr::value_type'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#afbcc36a96b07356c66b64e23cc644a25',1,'cv::cudev::GpuMat_::value_type'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#a0f86a4f5dea3efaeca40190141f607cf',1,'cv::cudev::IntegerAreaInterPtr::value_type'],['https://docs.opencv.org/4.2.0/d0/de6/structcv_1_1cudev_1_1LaplacianPtr_3_011_00_01SrcPtr_01_4.html#a833fc2f542245d6cf2972aba9cc28c6e',1,'cv::cudev::LaplacianPtr< 1, SrcPtr >::value_type'],['https://docs.opencv.org/4.2.0/d4/d89/structcv_1_1cudev_1_1LaplacianPtr_3_013_00_01SrcPtr_01_4.html#abba0e932f412f2bd4c3073e7fcd473d0',1,'cv::cudev::LaplacianPtr< 3, SrcPtr >::value_type'],['https://docs.opencv.org/4.2.0/d7/d8a/structcv_1_1cudev_1_1LinearInterPtr.html#a5184dcc3b4d8cfaaad45ee635c7a398d',1,'cv::cudev::LinearInterPtr::value_type'],['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html#ac0af1df141d2e05a85960b72f014be5c',1,'cv::cudev::LutPtr::value_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a158a65c8a108736a88569d620456b0b1',1,'cv::Mat_::value_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a158a65c8a108736a88569d620456b0b1',1,'Mat_< double >::value_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a158a65c8a108736a88569d620456b0b1',1,'Mat_< float >::value_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a158a65c8a108736a88569d620456b0b1',1,'Mat_< uchar >::value_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a158a65c8a108736a88569d620456b0b1',1,'Mat_< unsigned char >::value_type'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a2fcc0be693f0ad52e028700abcfda159',1,'cv::MatConstIterator::value_type'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a266112c9e0fe894f48b98655f5fc96d4',1,'cv::MatConstIterator_::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'cv::Matx::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< _Tp, cn, 1 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, 1, 3 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, 2, 2 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, 2, 3 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, 3, 3 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, 3, 4 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, 4, 4 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< double, cn, 1 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< float, 2, 3 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< float, 3, 3 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< float, cn, 1 >::value_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a413a1bcfbd47601b2336a9eff1d39b51',1,'Matx< float_type, 4, 4 >::value_type'],['https://docs.opencv.org/4.2.0/d0/df5/structcv_1_1cudev_1_1NearestInterPtr.html#a4c37c1ede6163b8f4dbc383d82d1b640',1,'cv::cudev::NearestInterPtr::value_type'],['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1NormHamming.html#a9573082d4c79f99f070e4f423ddd03e7',1,'cv::cudev::NormHamming::value_type'],['https://docs.opencv.org/4.2.0/d7/df8/structcv_1_1cudev_1_1NormL1.html#a3e665fa04957df1c22a7fc80da1f23c2',1,'cv::cudev::NormL1::value_type'],['https://docs.opencv.org/4.2.0/d5/d1e/structcv_1_1cudev_1_1NormL1_3_01float_01_4.html#ae2073255bd638f413ca84b3c012de9c2',1,'cv::cudev::NormL1< float >::value_type'],['https://docs.opencv.org/4.2.0/dc/da6/structcv_1_1cudev_1_1NormL2.html#a8caf670c16b4b8071c47fe2b055636f1',1,'cv::cudev::NormL2::value_type'],['https://docs.opencv.org/4.2.0/df/d20/structcv_1_1cudev_1_1PerspectiveMapPtr.html#afca28471100fa13ff7e13d643af00ce2',1,'cv::cudev::PerspectiveMapPtr::value_type'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a111f5f8f7368a1c738f4e5063473aa78',1,'cv::Point3_::value_type'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#ac81cd00bbdd5d66cf87e32654596160e',1,'cv::Point_::value_type'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#ac81cd00bbdd5d66cf87e32654596160e',1,'Point_< double >::value_type'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#ac81cd00bbdd5d66cf87e32654596160e',1,'Point_< float >::value_type'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#ac81cd00bbdd5d66cf87e32654596160e',1,'Point_< int >::value_type'],['https://docs.opencv.org/4.2.0/df/db4/structcv_1_1cudev_1_1PtrTraits_3_01Expr_3_01Body_01_4_01_4.html#a02d60371989229ec00014c5ce57a2487',1,'cv::cudev::PtrTraits< Expr< Body > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'cv::cudev::PtrTraitsBase::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< AffineMapPtrSz, AffineMapPtr >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< BinaryTransformPtrSz< Src1Ptr, Src2Ptr, Op >, BinaryTransformPtr< Src1Ptr, Src2Ptr, Op > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< CommonAreaInterPtrSz< SrcPtr >, CommonAreaInterPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< ConstantPtrSz< T >, ConstantPtr< T > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< CubicInterPtrSz< SrcPtr >, CubicInterPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< DerivXPtrSz< SrcPtr >, DerivXPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< DerivYPtrSz< SrcPtr >, DerivYPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< GlobPtrSz< T >, GlobPtr< T > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< GpuMat_< T >, GlobPtr< T > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< IntegerAreaInterPtrSz< SrcPtr >, IntegerAreaInterPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< LaplacianPtrSz< ksize, SrcPtr >, LaplacianPtr< ksize, SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< LinearInterPtrSz< SrcPtr >, LinearInterPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< LutPtrSz< SrcPtr, TablePtr >, LutPtr< SrcPtr, TablePtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< NearestInterPtrSz< SrcPtr >, NearestInterPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< PerspectiveMapPtrSz, PerspectiveMapPtr >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< Ptr2DSz, Ptr2DSz >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< RemapPtr1Sz< SrcPtr, MapPtr >, RemapPtr1< SrcPtr, MapPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< RemapPtr2Sz< SrcPtr, MapXPtr, MapYPtr >, RemapPtr2< SrcPtr, MapXPtr, MapYPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< ResizePtrSz< SrcPtr >, ResizePtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< ScharrXPtrSz< SrcPtr >, ScharrXPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< ScharrYPtrSz< SrcPtr >, ScharrYPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< SingleMaskChannelsSz< MaskPtr >, SingleMaskChannels< MaskPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< SobelXPtrSz< SrcPtr >, SobelXPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< SobelYPtrSz< SrcPtr >, SobelYPtr< SrcPtr > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< SrcPtr, SrcPtr >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< Texture< T >, TexturePtr< T > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< UnaryTransformPtrSz< SrcPtr, Op >, UnaryTransformPtr< SrcPtr, Op > >::value_type'],['https://docs.opencv.org/4.2.0/db/d3c/structcv_1_1cudev_1_1PtrTraitsBase.html#af2c82f45c891a5ecf7ad2f039412ca2a',1,'PtrTraitsBase< ZipPtrSz< PtrTuple >, ZipPtr< PtrTuple > >::value_type'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a4cd2a47bea4cdc776e623625827a1601',1,'cv::Rect_::value_type'],['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html#a88ec7ab5b1e7a462e1e8487de0104f79',1,'cv::cudev::RemapPtr1::value_type'],['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#adfc1777dbf6296658a92d711bb777df2',1,'cv::cudev::RemapPtr2::value_type'],['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#aa680a99e8d80b04d63d178cdc88268fb',1,'cv::cudev::ResizePtr::value_type'],['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1ScharrXPtr.html#ad69afc6c315f9ae0fa93b25cfb7fefc5',1,'cv::cudev::ScharrXPtr::value_type'],['https://docs.opencv.org/4.2.0/d0/d70/structcv_1_1cudev_1_1ScharrYPtr.html#ae9fae41c0ee95a499dd46f7284ad4633',1,'cv::cudev::ScharrYPtr::value_type'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#aa4c3ef3ed9cb353439fcc4a6d17ee0a8',1,'cv::cudev::SingleMaskChannels::value_type'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a545d43b608de451311855c2ef808642d',1,'cv::Size_::value_type'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a545d43b608de451311855c2ef808642d',1,'Size_< float >::value_type'],['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1SobelXPtr.html#a8b0d69b3ee461ea3d19f9bdca8840eed',1,'cv::cudev::SobelXPtr::value_type'],['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1SobelYPtr.html#a993a97bd8004ad0aa2c33289cb72478c',1,'cv::cudev::SobelYPtr::value_type'],['https://docs.opencv.org/4.2.0/d2/d09/structcv_1_1cudev_1_1TexturePtr.html#a77a35e45462c33b161436ce97bf9a19d',1,'cv::cudev::TexturePtr::value_type'],['https://docs.opencv.org/4.2.0/dd/d01/structcv_1_1cudev_1_1UnaryTransformPtr.html#ac8e8dc328ddbf4fcc282621686e03851',1,'cv::cudev::UnaryTransformPtr::value_type'],['https://docs.opencv.org/4.2.0/d5/d9e/structcv_1_1V__TypeTraits_3_01double_01_4.html#aa986cfd9bb0e4d8d842f8d2d92558654',1,'cv::V_TypeTraits< double >::value_type'],['https://docs.opencv.org/4.2.0/da/d19/structcv_1_1V__TypeTraits_3_01float_01_4.html#a0fee3bee22d56ecb4a680759e357b81b',1,'cv::V_TypeTraits< float >::value_type'],['https://docs.opencv.org/4.2.0/db/d59/structcv_1_1V__TypeTraits_3_01int64_01_4.html#a58464c93b896dfd383b2f5ca5c9012d5',1,'cv::V_TypeTraits< int64 >::value_type'],['https://docs.opencv.org/4.2.0/d0/d9d/structcv_1_1V__TypeTraits_3_01schar_01_4.html#a7bb6e9ae632bd9ea32240462fe4c82ac',1,'cv::V_TypeTraits< schar >::value_type'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1V__TypeTraits_3_01short_01_4.html#aa3eb52b796d8660d9d0e8e253cffb1c0',1,'cv::V_TypeTraits< short >::value_type'],['https://docs.opencv.org/4.2.0/dd/d1d/structcv_1_1V__TypeTraits_3_01uchar_01_4.html#a2c9d07a8e6aa4f0df42675159fc0504d',1,'cv::V_TypeTraits< uchar >::value_type'],['https://docs.opencv.org/4.2.0/d2/d4d/structcv_1_1V__TypeTraits_3_01uint64_01_4.html#a3942c0cdb8cce596a0481909ad5e8748',1,'cv::V_TypeTraits< uint64 >::value_type'],['https://docs.opencv.org/4.2.0/d3/d8c/structcv_1_1V__TypeTraits_3_01unsigned_01_4.html#a8ae0daeb54f28771c3d2daa6e3dac7dc',1,'cv::V_TypeTraits< unsigned >::value_type'],['https://docs.opencv.org/4.2.0/d6/dd5/structcv_1_1V__TypeTraits_3_01ushort_01_4.html#a634b31d099dfb9255ab5df206a82dc54',1,'cv::V_TypeTraits< ushort >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'cv::Vec::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< _Tp, 4 >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< double, 2 >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< double, 3 >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< double, 4 >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< double, GPCPatchDescriptor::nFeatures >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< double, nFeatures >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< float, 2 >::value_type'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#adca5e5fb1c491d3f253c9110777969aa',1,'Vec< float, 3 >::value_type'],['https://docs.opencv.org/4.2.0/da/d2c/structcv_1_1cudev_1_1WithOutMask.html#a9c88bf9c3fc6a1b51844923df49eaeb2',1,'cv::cudev::WithOutMask::value_type'],['https://docs.opencv.org/4.2.0/dd/de4/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_01_4_01_4.html#a83b5330f7d39d66152e5fa61d58daa5c',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1 > >::value_type'],['https://docs.opencv.org/4.2.0/d4/dff/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_01_4_01_4.html#ae78111cfb7344ab266ac9bb5b952ccaf',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2 > >::value_type'],['https://docs.opencv.org/4.2.0/dd/d2b/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_00_01Ptr3_01_4_01_4.html#a14fb1050db5a36007640ba28b645caff',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2, Ptr3 > >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a67882de51ea972e066ed1ea5e39ae76c',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11631.html#ac8e3c7ff2237536b5567dc23b5218d38',1,'__gnu_pbds::detail::bin_search_tree_node_it_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#af7d6e44fa7c917f95357a470af816658',1,'__gnu_pbds::detail::binary_heap_const_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#af4eb9042a7175d970490ed0cdd89eda4',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#ad38e84193ee9d64e723d209b57d94656',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a0d64aeaf34a1aa7635345e4100c2da38',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#aa51dca0f6ab162918c10679e8feb57df',1,'allocator_traits< _Tp_alloc_type >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#a090d57c081a3e220bbe416e6b618f9f5',1,'const_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< input_iterator_tag, _CharT, _Traits::off_type, _CharT *, _CharT >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< input_iterator_tag, _Tp, _Dist, const _Tp *, const _Tp & >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< iterator_traits< _Iterator >::iterator_category, iterator_traits< _Iterator >::value_type, iterator_traits< _Iterator >::difference_type, iterator_traits< _Iterator >::pointer, iterator_traits< _Iterator >::reference >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< output_iterator_tag, void, void, void, void >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< std::output_iterator_tag, void, void, void, void >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< std::random_access_iterator_tag, _CharT >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'iterator< std::random_access_iterator_tag, bool >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a68da9e97879135d05aa37f27e2c826c4',1,'iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a6b4407e8d88685be7370f32a7f8046ba',1,'point_const_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#aa45ff42c6115d26f80c83e5a20ba4485',1,'point_iterator_::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#aa51dca0f6ab162918c10679e8feb57df',1,'std::allocator_traits::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a714ab1320373db07c7999b4f98bae091',1,'std::allocator_traits< allocator< _Tp > >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::back_insert_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a2c87f5c1ef86cd0a4b1ea60205b50924',1,'std::complex::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::front_insert_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::insert_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::istream_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::istreambuf_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::ostream_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::ostreambuf_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::raw_storage_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#af9f36b7adb257959eef192b9282f1284',1,'std::reverse_iterator::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3e752147bbbb2d617e85d6a9f15cd57b',1,'std::set::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3e752147bbbb2d617e85d6a9f15cd57b',1,'std::set::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af7e7d39b4a188c7aa535d0431ae8f14c',1,'std::unordered_map::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af7e7d39b4a188c7aa535d0431ae8f14c',1,'std::unordered_map::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a4baa45433c393ecfab2c784b8de381e8',1,'std::unordered_multimap::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a4baa45433c393ecfab2c784b8de381e8',1,'std::unordered_multimap::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a3b9af18ceb55369b7be262668119ff8c',1,'std::unordered_multiset::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a3b9af18ceb55369b7be262668119ff8c',1,'std::unordered_multiset::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a14e45fe3da6c5bb759688d5aed9183ff',1,'std::unordered_set::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a14e45fe3da6c5bb759688d5aed9183ff',1,'std::unordered_set::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af7e7d39b4a188c7aa535d0431ae8f14c',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::value_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af7e7d39b4a188c7aa535d0431ae8f14c',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9276182dab8236c33f1e7abf491d504d',1,'Eigen::DenseBase::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9276182dab8236c33f1e7abf491d504d',1,'DenseBase< ArrayWrapper< ExpressionType > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9276182dab8236c33f1e7abf491d504d',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9276182dab8236c33f1e7abf491d504d',1,'DenseBase< Solve< Decomposition, RhsType > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac254d3b61718ebc2136d27bac043dcb7',1,'Eigen::SparseMatrixBase::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac254d3b61718ebc2136d27bac043dcb7',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac254d3b61718ebc2136d27bac043dcb7',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac254d3b61718ebc2136d27bac043dcb7',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac254d3b61718ebc2136d27bac043dcb7',1,'SparseMatrixBase< Transpose< MatrixType > >::value_type'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac254d3b61718ebc2136d27bac043dcb7',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::value_type'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a57c816a20c1d3ccc9bbc2972829da847.html#a57c816a20c1d3ccc9bbc2972829da847',1,'nlohmann::basic_json::value_type']]], + ['valueoffset_174',['valueOffset',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#a6b09668278ec34c931b93d6f7bb1547c',1,'cv::SparseMat::Hdr']]], + ['valueptr_175',['valuePtr',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'Eigen::SparseCompressedBase::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'Eigen::SparseCompressedBase::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< Derived >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< Derived >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a3990734332d9ef15b09efaa552a2fb19',1,'SparseCompressedBase< Transpose< MatrixType > >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a891c75ed270dde48054db2603a774b76',1,'SparseCompressedBase< Transpose< MatrixType > >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a574ea9371c22eabebdda21c0787312dc',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html#af91648a18729ae8ff29cb1d8751c5655',1,'Eigen::SparseMapBase< Derived, WriteAccessors >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2684952b14b5c9b0f68ae3bb8c517a6',1,'Eigen::SparseMatrix::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9d4354d3f4d121d764bbed33cac05329',1,'Eigen::SparseMatrix::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2684952b14b5c9b0f68ae3bb8c517a6',1,'SparseMatrix< Scalar >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9d4354d3f4d121d764bbed33cac05329',1,'SparseMatrix< Scalar >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2684952b14b5c9b0f68ae3bb8c517a6',1,'SparseMatrix< Scalar, ColMajor, int >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9d4354d3f4d121d764bbed33cac05329',1,'SparseMatrix< Scalar, ColMajor, int >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2684952b14b5c9b0f68ae3bb8c517a6',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9d4354d3f4d121d764bbed33cac05329',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::valuePtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ac2684952b14b5c9b0f68ae3bb8c517a6',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::valuePtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9d4354d3f4d121d764bbed33cac05329',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::valuePtr() const']]], + ['values_176',['Optional values',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html',1,'']]], + ['valuetype_177',['ValueType',['https://docs.opencv.org/4.2.0/d3/d59/structcv_1_1Hamming.html#ad95bdbcd7f1e66f2ac76168a75475976',1,'cv::Hamming::ValueType'],['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1L1.html#a03e450655ea3ca64f331f9296b510637',1,'cv::L1::ValueType'],['https://docs.opencv.org/4.2.0/dc/daa/structcv_1_1L2.html#ad25afc9e28cdb4d9dfde1a7b6feafd08',1,'cv::L2::ValueType'],['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html#ad09e5e995b1da2bb0ac47dea18e3fb5b',1,'cv::SL2::ValueType']]], + ['var_5fcategorical_178',['VAR_CATEGORICAL',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggafd82a0e568907b8680027cb246a6eb06aa27f7cc3f72af77e1c2b39f5d91db078',1,'cv::ml::VAR_CATEGORICAL'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggafd82a0e568907b8680027cb246a6eb06aa27f7cc3f72af77e1c2b39f5d91db078',1,'VAR_CATEGORICAL(Global Namespace)']]], + ['var_5fnumerical_179',['VAR_NUMERICAL',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggafd82a0e568907b8680027cb246a6eb06ae94fb869759383fce5f02a63b4666a3f',1,'cv::ml::VAR_NUMERICAL'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggafd82a0e568907b8680027cb246a6eb06ae94fb869759383fce5f02a63b4666a3f',1,'VAR_NUMERICAL(Global Namespace)']]], + ['var_5fordered_180',['VAR_ORDERED',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggafd82a0e568907b8680027cb246a6eb06a077b19eb913ac28b0a7ca765943cd188',1,'cv::ml::VAR_ORDERED'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ggafd82a0e568907b8680027cb246a6eb06a077b19eb913ac28b0a7ca765943cd188',1,'VAR_ORDERED(Global Namespace)']]], + ['variables_181',['Condition Variables',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html',1,'']]], + ['variabletypes_182',['VariableTypes',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gafd82a0e568907b8680027cb246a6eb06',1,'cv::ml::VariableTypes'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gafd82a0e568907b8680027cb246a6eb06',1,'VariableTypes(Global Namespace)']]], + ['variant_183',['variant',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html',1,'cv::util::variant< Ts >'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a204de4b74e5394c354ee97bfd1b2a320',1,'cv::util::variant::variant() noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a7eded4ad52972cb36fe84b6d3430d3f1',1,'cv::util::variant::variant(const variant &other)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a07d8a0b9c7bbce035cdd045fd9ac3aec',1,'cv::util::variant::variant(variant &&other) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#aa0c548f7b131f3fd2056f8cfb1727c90',1,'cv::util::variant::variant(const T &t)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ae6a7772dd43b6fa1b7bb53d7b8ede17a',1,'cv::util::variant::variant(T &&t, typename detail::are_different< variant, T, int >::type=0)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a204de4b74e5394c354ee97bfd1b2a320',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::variant() noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a7eded4ad52972cb36fe84b6d3430d3f1',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::variant(const variant &other)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a07d8a0b9c7bbce035cdd045fd9ac3aec',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::variant(variant &&other) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#aa0c548f7b131f3fd2056f8cfb1727c90',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::variant(const T &t)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ae6a7772dd43b6fa1b7bb53d7b8ede17a',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::variant(T &&t, typename detail::are_different< variant, T, int >::type=0)']]], + ['variant_2ehpp_184',['variant.hpp',['https://docs.opencv.org/4.2.0/d9/d7a/variant_8hpp.html',1,'']]], + ['variant_3c_20cv_3a_3autil_3a_3amonostate_2c_20ro_5fext_5ft_2c_20rw_5fext_5ft_2c_20rw_5fown_5ft_20_3e_185',['variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html',1,'']]], + ['variant_3c_20nothing_2c_20t_20_3e_186',['variant< nothing, T >',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html',1,'']]], + ['variationalrefinement_187',['VariationalRefinement',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html',1,'cv']]], + ['varidx_188',['varIdx',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#a82c0fe26489dc99a4e560a7b97c3ecef',1,'cv::ml::DTrees::Split']]], + ['vavg2_189',['vavg2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8635d8429a01073075a189e45472637b',1,'cv::cudev::vavg2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8635d8429a01073075a189e45472637b',1,'vavg2()(Global Namespace)']]], + ['vavg4_190',['vavg4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26fe1ab7bbf8d42d15778c4a33942c25',1,'cv::cudev::vavg4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26fe1ab7bbf8d42d15778c4a33942c25',1,'vavg4()(Global Namespace)']]], + ['vavrg2_191',['vavrg2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d65e10ea4aadee07d6bf64a5cd124b6',1,'cv::cudev::vavrg2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d65e10ea4aadee07d6bf64a5cd124b6',1,'vavrg2()(Global Namespace)']]], + ['vavrg4_192',['vavrg4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4db95f1f4957d445cf44f3b971696012',1,'cv::cudev::vavrg4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4db95f1f4957d445cf44f3b971696012',1,'vavrg4()(Global Namespace)']]], + ['vc1_193',['VC1',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146ad8aeb35f84f90985490476b6b305d70f',1,'cv::cudacodec::VC1'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146ad8aeb35f84f90985490476b6b305d70f',1,'VC1(Global Namespace)']]], + ['vcmpeq2_194',['vcmpeq2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad69622fde93f93e51bfb9d003457035',1,'cv::cudev::vcmpeq2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad69622fde93f93e51bfb9d003457035',1,'vcmpeq2()(Global Namespace)']]], + ['vcmpeq4_195',['vcmpeq4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490f2147e0f52fde56eee6ef068bdc2a',1,'cv::cudev::vcmpeq4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490f2147e0f52fde56eee6ef068bdc2a',1,'vcmpeq4()(Global Namespace)']]], + ['vcmpge2_196',['vcmpge2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43512196d41f198a5c6f08c903fc7dac',1,'cv::cudev::vcmpge2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43512196d41f198a5c6f08c903fc7dac',1,'vcmpge2()(Global Namespace)']]], + ['vcmpge4_197',['vcmpge4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07ed1834e5be35f07abcad584c884655',1,'cv::cudev::vcmpge4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07ed1834e5be35f07abcad584c884655',1,'vcmpge4()(Global Namespace)']]], + ['vcmpgt2_198',['vcmpgt2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8976e5ab34ccd5fcd500205a3bb718bb',1,'cv::cudev::vcmpgt2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8976e5ab34ccd5fcd500205a3bb718bb',1,'vcmpgt2()(Global Namespace)']]], + ['vcmpgt4_199',['vcmpgt4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga689437dbed283333a8edfcce80ae0b64',1,'cv::cudev::vcmpgt4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga689437dbed283333a8edfcce80ae0b64',1,'vcmpgt4()(Global Namespace)']]], + ['vcmple2_200',['vcmple2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe0f777d27b15696ae3e859268113048',1,'cv::cudev::vcmple2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe0f777d27b15696ae3e859268113048',1,'vcmple2()(Global Namespace)']]], + ['vcmple4_201',['vcmple4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be660977cb33535a020c1b453702360',1,'cv::cudev::vcmple4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be660977cb33535a020c1b453702360',1,'vcmple4()(Global Namespace)']]], + ['vcmplt2_202',['vcmplt2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5d86d0b05c3913ae727bde6cf762969',1,'cv::cudev::vcmplt2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5d86d0b05c3913ae727bde6cf762969',1,'vcmplt2()(Global Namespace)']]], + ['vcmplt4_203',['vcmplt4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b3085d21f688f9735e3ddea0b39b600',1,'cv::cudev::vcmplt4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b3085d21f688f9735e3ddea0b39b600',1,'vcmplt4()(Global Namespace)']]], + ['vcmpne2_204',['vcmpne2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafec1064313a526d42093e9970dc6fe4',1,'cv::cudev::vcmpne2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafec1064313a526d42093e9970dc6fe4',1,'vcmpne2()(Global Namespace)']]], + ['vcmpne4_205',['vcmpne4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga313926d4ce24905c750d65a00f4de0ac',1,'cv::cudev::vcmpne4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga313926d4ce24905c750d65a00f4de0ac',1,'vcmpne4()(Global Namespace)']]], + ['vconcat_206',['vconcat',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga744f53b69f6e4f12156cdde4e76aed27',1,'cv::vconcat(const Mat *src, size_t nsrc, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaad07cede730cdde64b90e987aad179b8',1,'cv::vconcat(InputArray src1, InputArray src2, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga558e169e15adcc46b8cdcc6cd215070f',1,'cv::vconcat(InputArrayOfArrays src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga744f53b69f6e4f12156cdde4e76aed27',1,'vconcat(const Mat *src, size_t nsrc, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaad07cede730cdde64b90e987aad179b8',1,'vconcat(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga558e169e15adcc46b8cdcc6cd215070f',1,'vconcat(InputArrayOfArrays src, OutputArray dst)(Global Namespace)']]], + ['vec_207',['Vec',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< _Tp, cn >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'cv::Vec::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'cv::Vec::Vec(_Tp v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'cv::Vec::Vec(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'cv::Vec::Vec(const _Tp *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'cv::Vec::Vec(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'cv::Vec::Vec(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'cv::Vec::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'cv::Vec::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'cv::Vec::Vec(const Matx< _Tp, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< _Tp, 4 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< _Tp, 4 >::Vec(_Tp v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< _Tp, 4 >::Vec(const _Tp *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< _Tp, 4 >::Vec(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< _Tp, 4 >::Vec(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< _Tp, 4 >::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< _Tp, 4 >::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< _Tp, 4 >::Vec(const Matx< _Tp, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, 2 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, 2 >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, 2 >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, 2 >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, 2 >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, 2 >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, 2 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, 2 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, 2 >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, 3 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, 3 >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, 3 >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, 3 >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, 3 >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, 3 >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, 3 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, 3 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, 3 >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, 4 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, 4 >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, 4 >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, 4 >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, 4 >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, 4 >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, 4 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, 4 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, 4 >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, nFeatures >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, nFeatures >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, nFeatures >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, nFeatures >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, nFeatures >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, nFeatures >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, nFeatures >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< float, 2 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< float, 2 >::Vec(float v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< float, 2 >::Vec(float v0, float v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< float, 2 >::Vec(const float *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< float, 2 >::Vec(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< float, 2 >::Vec(const Vec< float, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< float, 2 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< float, 2 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< float, 2 >::Vec(const Matx< float, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< float, 3 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< float, 3 >::Vec(float v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< float, 3 >::Vec(float v0, float v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< float, 3 >::Vec(const float *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< float, 3 >::Vec(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< float, 3 >::Vec(const Vec< float, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< float, 3 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< float, 3 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< float, 3 >::Vec(const Matx< float, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)']]], + ['vec_208',['vec',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'Eigen::QuaternionBase::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'Eigen::QuaternionBase::vec() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::vec() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::vec() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::vec() const'],['../structkinematics_1_1gearpos__t.html#a9389e03d0ec896769bbe7bf3e2673a26',1,'kinematics::gearpos_t::vec()'],['../structkinematics_1_1jointpos__t.html#a1c3501bdc6b433d9aec164be2467b80b',1,'kinematics::jointpos_t::vec()']]], ['vec2b_209',['Vec2b',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga595458e63aa1443ddd5c51fa71d70e2a',1,'cv::Vec2b'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga595458e63aa1443ddd5c51fa71d70e2a',1,'cv::Vec2b'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga595458e63aa1443ddd5c51fa71d70e2a',1,'Vec2b(Global Namespace)']]], ['vec2d_210',['Vec2d',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf20d857c2077c986d3b303e3d58bbc54',1,'cv::Vec2d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf20d857c2077c986d3b303e3d58bbc54',1,'cv::Vec2d'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf20d857c2077c986d3b303e3d58bbc54',1,'Vec2d(Global Namespace)']]], ['vec2f_211',['Vec2f',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga392bb4f8a6b9e0dde07f31dc28e73319',1,'cv::Vec2f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga392bb4f8a6b9e0dde07f31dc28e73319',1,'cv::Vec2f'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga392bb4f8a6b9e0dde07f31dc28e73319',1,'Vec2f(Global Namespace)']]], @@ -234,21 +234,21 @@ var searchData= ['vec8i_231',['Vec8i',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3c0eb56d15c13ca6708f168919af3a6a',1,'cv::Vec8i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3c0eb56d15c13ca6708f168919af3a6a',1,'cv::Vec8i'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3c0eb56d15c13ca6708f168919af3a6a',1,'Vec8i(Global Namespace)']]], ['vec_3c_20_5ftp_2c_204_20_3e_232',['Vec< _Tp, 4 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], ['vec_3c_20double_2c_202_20_3e_233',['Vec< double, 2 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20double_2c_203_20_3e_234',['Vec< double, 3 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20double_2c_204_20_3e_235',['Vec< double, 4 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20double_2c_20gpcpatchdescriptor_3a_3anfeatures_20_3e_236',['Vec< double, GPCPatchDescriptor::nFeatures >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20double_2c_20nfeatures_20_3e_237',['Vec< double, nFeatures >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20float_2c_202_20_3e_238',['Vec< float, 2 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20float_2c_203_20_3e_239',['Vec< float, 3 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20int_2c_203_20_3e_240',['Vec< int, 3 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], + ['vec_3c_20double_2c_203_20_3e_234',['Vec< double, 3 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< double, 3 >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< double, 3 >']]], + ['vec_3c_20double_2c_204_20_3e_235',['Vec< double, 4 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< double, 4 >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< double, 4 >']]], + ['vec_3c_20double_2c_20gpcpatchdescriptor_3a_3anfeatures_20_3e_236',['Vec< double, GPCPatchDescriptor::nFeatures >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< double, GPCPatchDescriptor::nFeatures >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< double, GPCPatchDescriptor::nFeatures >']]], + ['vec_3c_20double_2c_20nfeatures_20_3e_237',['Vec< double, nFeatures >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< double, nFeatures >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< double, nFeatures >']]], + ['vec_3c_20float_2c_202_20_3e_238',['Vec< float, 2 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< float, 2 >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< float, 2 >']]], + ['vec_3c_20float_2c_203_20_3e_239',['Vec< float, 3 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< float, 3 >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< float, 3 >']]], + ['vec_3c_20int_2c_203_20_3e_240',['Vec< int, 3 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< int, 3 >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< int, 3 >']]], ['vec_5fdistance_2ehpp_241',['vec_distance.hpp',['https://docs.opencv.org/4.2.0/d7/d23/modules_2core_2include_2opencv2_2core_2cuda_2vec__distance_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/dbb/contrib_2modules_2cudev_2include_2opencv2_2cudev_2block_2vec__distance_8hpp.html',1,'(Global Namespace)']]], ['vec_5fmath_2ehpp_242',['vec_math.hpp',['https://docs.opencv.org/4.2.0/d4/da9/modules_2core_2include_2opencv2_2core_2cuda_2vec__math_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d1b/contrib_2modules_2cudev_2include_2opencv2_2cudev_2util_2vec__math_8hpp.html',1,'(Global Namespace)']]], ['vec_5ftraits_2ehpp_243',['vec_traits.hpp',['https://docs.opencv.org/4.2.0/de/d6f/modules_2core_2include_2opencv2_2core_2cuda_2vec__traits_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d0d/contrib_2modules_2cudev_2include_2opencv2_2cudev_2util_2vec__traits_8hpp.html',1,'(Global Namespace)']]], ['veccommainitializer_244',['VecCommaInitializer',['https://docs.opencv.org/4.2.0/d1/d3e/classcv_1_1VecCommaInitializer.html',1,'cv::VecCommaInitializer< _Tp, m >'],['https://docs.opencv.org/4.2.0/d1/d3e/classcv_1_1VecCommaInitializer.html#ac5bdd3d3be05ff80a551f7394bad57fe',1,'cv::VecCommaInitializer::VecCommaInitializer()']]], ['veclen_245',['veclen',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1flann_1_1GenericIndex.html#a51e8e412d2743612d626d4280ad9483d',1,'cv::flann::GenericIndex']]], ['vecoptypetostr_246',['vecopTypeToStr',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga87fc1246a42a1f4c46eeea3ad5ce1790',1,'cv::ocl::vecopTypeToStr()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga87fc1246a42a1f4c46eeea3ad5ce1790',1,'vecopTypeToStr()(Global Namespace)']]], - ['vector_247',['vector',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08899.html',1,'std::__debug::vector< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< _Tp, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00182.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08899.html#ae41f4262ebb8fc69f3a5f562498b5c2c',1,'std::__debug::vector::vector()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'std::vector::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'std::vector::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'std::vector::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'std::vector::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'std::vector::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'std::vector::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'std::vector::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'std::vector::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'std::vector::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'std::vector::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< __diff_type >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< __diff_type >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< __diff_type >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< __diff_type >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< __diff_type >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< __diff_type >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< __diff_type >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< __diff_type >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< __diff_type >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< __diff_type >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _CharClassT >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _CharClassT >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _CharClassT >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _CharClassT >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _CharClassT >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _CharClassT >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _CharClassT >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _CharClassT >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _CharClassT >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _CharClassT >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _CharT >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _CharT >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _CharT >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _CharT >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _CharT >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _CharT >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _CharT >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _CharT >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _CharT >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _CharT >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _Cmpt >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _Cmpt >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _Cmpt >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _Cmpt >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _Cmpt >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _Cmpt >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _Cmpt >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _Cmpt >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _Cmpt >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _Cmpt >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _Node *, _Nodeptr_Alloc >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _Node *, _Nodeptr_Alloc >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _Node *, _Nodeptr_Alloc >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _Node *, _Nodeptr_Alloc >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _Node *, _Nodeptr_Alloc >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _Node *, _Nodeptr_Alloc >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _Node *, _Nodeptr_Alloc >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _Node *, _Nodeptr_Alloc >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _Node *, _Nodeptr_Alloc >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _Node *, _Nodeptr_Alloc >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _RealType >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _RealType >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _RealType >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _RealType >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _RealType >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _RealType >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _RealType >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _RealType >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _RealType >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _RealType >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _State< _TraitsT::char_type > >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _State< _TraitsT::char_type > >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _State< _TraitsT::char_type > >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _State< _TraitsT::char_type > >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _State< _TraitsT::char_type > >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _State< _TraitsT::char_type > >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _State< _TraitsT::char_type > >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _State< _TraitsT::char_type > >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _State< _TraitsT::char_type > >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _State< _TraitsT::char_type > >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _StringT >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _StringT >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _StringT >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _StringT >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _StringT >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _StringT >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _StringT >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _StringT >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _StringT >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _StringT >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< block_type, allocator_type >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< block_type, allocator_type >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< block_type, allocator_type >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< block_type, allocator_type >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< block_type, allocator_type >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< block_type, allocator_type >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< block_type, allocator_type >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< block_type, allocator_type >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< block_type, allocator_type >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< block_type, allocator_type >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< Catalog_info * >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< Catalog_info * >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< Catalog_info * >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< Catalog_info * >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< Catalog_info * >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< Catalog_info * >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< Catalog_info * >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< Catalog_info * >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< Catalog_info * >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< Catalog_info * >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< double >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< double >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< double >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< double >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< double >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< double >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< double >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< double >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< double >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< double >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< int >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< int >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< int >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< int >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< int >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< int >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< int >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< int >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< int >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< int >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< result_type >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< result_type >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< result_type >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< result_type >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< result_type >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< result_type >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< result_type >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< result_type >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< result_type >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< result_type >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< size_t >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< size_t >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< size_t >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< size_t >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< size_t >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< size_t >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< size_t >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< size_t >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< size_t >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< size_t >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< std::pair< _BiIter, int > >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< std::pair< _BiIter, int > >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< std::pair< _BiIter, int > >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< std::pair< _BiIter, int > >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< std::pair< _BiIter, int > >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< std::pair< _BiIter, int > >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< std::pair< _BiIter, int > >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< std::pair< _BiIter, int > >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< std::pair< _BiIter, int > >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< std::pair< _BiIter, int > >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< std::pair< _StateIdT, std::vector > >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< std::pair< _StateIdT, std::vector > >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< std::pair< _StateIdT, std::vector > >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< std::pair< _StateIdT, std::vector > >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< std::pair< _StateIdT, std::vector > >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< std::pair< _StateIdT, std::vector > >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< std::pair< _StateIdT, std::vector > >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< std::pair< _StateIdT, std::vector > >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< std::pair< _StateIdT, std::vector > >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< std::pair< _StateIdT, std::vector > >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< sub_match< _BiIter >, _Alloc >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< sub_match< _BiIter >, _Alloc >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< sub_match< _BiIter >, _Alloc >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< sub_match< _BiIter >, _Alloc >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< sub_match< _BiIter >, _Alloc >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< sub_match< _BiIter >, _Alloc >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< sub_match< _BiIter >, _Alloc >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< sub_match< _BiIter >, _Alloc >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< sub_match< _BiIter >, _Alloc >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< sub_match< _BiIter >, _Alloc >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())']]], - ['vector_248',['Vector',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga2623c0d4641dda067fbdb9a009ef0c91',1,'Eigen::Vector'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga2623c0d4641dda067fbdb9a009ef0c91',1,'Vector(Global Namespace)']]], + ['vector_247',['Vector',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga2623c0d4641dda067fbdb9a009ef0c91',1,'Eigen::Vector'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga2623c0d4641dda067fbdb9a009ef0c91',1,'Vector(Global Namespace)']]], + ['vector_248',['vector',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08899.html',1,'std::__debug::vector< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< _Tp, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00182.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08899.html#ae41f4262ebb8fc69f3a5f562498b5c2c',1,'std::__debug::vector::vector()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'std::vector::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'std::vector::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'std::vector::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'std::vector::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'std::vector::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'std::vector::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'std::vector::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'std::vector::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'std::vector::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'std::vector::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< __diff_type >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< __diff_type >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< __diff_type >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< __diff_type >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< __diff_type >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< __diff_type >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< __diff_type >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< __diff_type >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< __diff_type >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< __diff_type >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _CharClassT >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _CharClassT >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _CharClassT >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _CharClassT >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _CharClassT >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _CharClassT >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _CharClassT >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _CharClassT >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _CharClassT >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _CharClassT >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _CharT >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _CharT >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _CharT >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _CharT >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _CharT >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _CharT >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _CharT >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _CharT >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _CharT >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _CharT >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _Cmpt >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _Cmpt >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _Cmpt >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _Cmpt >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _Cmpt >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _Cmpt >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _Cmpt >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _Cmpt >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _Cmpt >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _Cmpt >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _Node *, _Nodeptr_Alloc >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _Node *, _Nodeptr_Alloc >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _Node *, _Nodeptr_Alloc >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _Node *, _Nodeptr_Alloc >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _Node *, _Nodeptr_Alloc >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _Node *, _Nodeptr_Alloc >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _Node *, _Nodeptr_Alloc >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _Node *, _Nodeptr_Alloc >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _Node *, _Nodeptr_Alloc >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _Node *, _Nodeptr_Alloc >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _RealType >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _RealType >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _RealType >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _RealType >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _RealType >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _RealType >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _RealType >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _RealType >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _RealType >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _RealType >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _State< _TraitsT::char_type > >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _State< _TraitsT::char_type > >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _State< _TraitsT::char_type > >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _State< _TraitsT::char_type > >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _State< _TraitsT::char_type > >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _State< _TraitsT::char_type > >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _State< _TraitsT::char_type > >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _State< _TraitsT::char_type > >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _State< _TraitsT::char_type > >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _State< _TraitsT::char_type > >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< _StringT >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< _StringT >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< _StringT >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< _StringT >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< _StringT >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< _StringT >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< _StringT >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< _StringT >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< _StringT >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< _StringT >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< block_type, allocator_type >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< block_type, allocator_type >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< block_type, allocator_type >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< block_type, allocator_type >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< block_type, allocator_type >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< block_type, allocator_type >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< block_type, allocator_type >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< block_type, allocator_type >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< block_type, allocator_type >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< block_type, allocator_type >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< Catalog_info * >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< Catalog_info * >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< Catalog_info * >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< Catalog_info * >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< Catalog_info * >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< Catalog_info * >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< Catalog_info * >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< Catalog_info * >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< Catalog_info * >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< Catalog_info * >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< double >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< double >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< double >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< double >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< double >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< double >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< double >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< double >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< double >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< double >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< int >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< int >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< int >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< int >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< int >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< int >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< int >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< int >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< int >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< int >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< result_type >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< result_type >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< result_type >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< result_type >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< result_type >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< result_type >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< result_type >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< result_type >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< result_type >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< result_type >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< size_t >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< size_t >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< size_t >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< size_t >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< size_t >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< size_t >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< size_t >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< size_t >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< size_t >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< size_t >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< std::pair< _BiIter, int > >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< std::pair< _BiIter, int > >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< std::pair< _BiIter, int > >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< std::pair< _BiIter, int > >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< std::pair< _BiIter, int > >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< std::pair< _BiIter, int > >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< std::pair< _BiIter, int > >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< std::pair< _BiIter, int > >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< std::pair< _BiIter, int > >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< std::pair< _BiIter, int > >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< std::pair< _StateIdT, std::vector > >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< std::pair< _StateIdT, std::vector > >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< std::pair< _StateIdT, std::vector > >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< std::pair< _StateIdT, std::vector > >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< std::pair< _StateIdT, std::vector > >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< std::pair< _StateIdT, std::vector > >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< std::pair< _StateIdT, std::vector > >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< std::pair< _StateIdT, std::vector > >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< std::pair< _StateIdT, std::vector > >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< std::pair< _StateIdT, std::vector > >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< std::pair< _StrTransT, _StrTransT > >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< sub_match< _Bi_iter >, _Alloc >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1629a99cef9608b6d37cb67ce1e5c058',1,'vector< sub_match< _BiIter >, _Alloc >::vector()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab6d52bbbf36c0b4c6a61075ae2b87654',1,'vector< sub_match< _BiIter >, _Alloc >::vector(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a6b8074967f8051c5fbcbe5c7057775ec',1,'vector< sub_match< _BiIter >, _Alloc >::vector(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a501b56f5a3b8558587ca1be9029e1de5',1,'vector< sub_match< _BiIter >, _Alloc >::vector(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a002b00e3596af506a260bd957bee0212',1,'vector< sub_match< _BiIter >, _Alloc >::vector(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab046bf21cbed50d0847f467a3b6d463a',1,'vector< sub_match< _BiIter >, _Alloc >::vector(vector &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a325e3dbc4cd5c50fbfa108ff9e1a9bb9',1,'vector< sub_match< _BiIter >, _Alloc >::vector(const vector &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0ee9befcb22c62d123fa42761633a63b',1,'vector< sub_match< _BiIter >, _Alloc >::vector(vector &&__rv, const allocator_type &__m) noexcept(noexcept(vector(std::declval< vector && >(), std::declval< const allocator_type & >(), std::declval< typename _Alloc_traits::is_always_equal >())))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a010e6e6c437a7eb67dae7c052790cf94',1,'vector< sub_match< _BiIter >, _Alloc >::vector(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a8d611ffc7e37ca37dff8acabba2897a5',1,'vector< sub_match< _BiIter >, _Alloc >::vector(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())']]], ['vector_20arithmetic_249',['Matrix and vector arithmetic',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixArithmetic.html',1,'']]], ['vector_20machines_250',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], ['vector_20machines_20for_20non_20linearly_20separable_20data_251',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], @@ -258,7 +258,7 @@ var searchData= ['vector3_255',['Vector3',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a974c0529d55983b0b3a6d99a8466f331',1,'Eigen::QuaternionBase::Vector3'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a974c0529d55983b0b3a6d99a8466f331',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::Vector3'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a974c0529d55983b0b3a6d99a8466f331',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::Vector3'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a974c0529d55983b0b3a6d99a8466f331',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::Vector3'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga0af1f95a68328299e1e9b273e4934c7a',1,'Eigen::Vector3'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga0af1f95a68328299e1e9b273e4934c7a',1,'Vector3(Global Namespace)']]], ['vector4_256',['Vector4',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga299db30993dd4e9ca74c7691ad32d50b',1,'Eigen::Vector4'],['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html#ga299db30993dd4e9ca74c7691ad32d50b',1,'Vector4(Global Namespace)']]], ['vector_3c_20_5f_5fdiff_5ftype_20_3e_257',['vector< __diff_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20_5f_5fgnu_5fparallel_3a_3a_5fpiece_3c_20_5fdifferencetype_20_3e_20_3e_258',['vector< __gnu_parallel::_Piece< _DifferenceType > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20_5f_5fgnu_5fparallel_3a_3a_5fpiece_3c_20_5fdifferencetype_20_3e_20_3e_258',['vector< __gnu_parallel::_Piece< _DifferenceType > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< __gnu_parallel::_Piece< _DifferenceType > >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >']]], ['vector_3c_20_5fcharclasst_20_3e_259',['vector< _CharClassT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], ['vector_3c_20_5fchart_20_3e_260',['vector< _CharT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], ['vector_3c_20_5fcmpt_20_3e_261',['vector< _Cmpt >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], @@ -267,7 +267,7 @@ var searchData= ['vector_3c_20_5fstate_3c_20_5ftraitst_3a_3achar_5ftype_20_3e_20_3e_264',['vector< _State< _TraitsT::char_type > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], ['vector_3c_20_5fstringt_20_3e_265',['vector< _StringT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], ['vector_3c_20ar_3a_3amarkerpattern_20_3e_266',['vector< AR::MarkerPattern >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20block_5ftype_2c_20allocator_5ftype_20_3e_267',['vector< block_type, allocator_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20block_5ftype_2c_20allocator_5ftype_20_3e_267',['vector< block_type, allocator_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< block_type, allocator_type >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'vector< block_type, allocator_type >']]], ['vector_3c_20bool_2c_20_5falloc_20_3e_268',['vector< bool, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07303.html',1,'std']]], ['vector_3c_20catalog_5finfo_20_2a_20_3e_269',['vector< Catalog_info * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], ['vector_3c_20connhandler_5ft_20_3e_270',['vector< connhandler_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], @@ -300,41 +300,41 @@ var searchData= ['vector_3c_20cv_3a_3arect_5f_20_3e_297',['vector< cv::Rect_ >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], ['vector_3c_20cv_3a_3asize_5f_20_3e_298',['vector< cv::Size_ >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], ['vector_3c_20cv_3a_3aumat_20_3e_299',['vector< cv::UMat >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20double_20_3e_300',['vector< double >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20float_20_3e_301',['vector< float >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20garg_20_3e_302',['vector< GArg >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20gprotoarg_20_3e_303',['vector< GProtoArg >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20h264encoder_3a_3ax264_5fnal_5ft_5fsimple_20_3e_304',['vector< h264encoder::x264_nal_t_simple >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20int_20_3e_305',['vector< int >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20point_5f_3c_20float_20_3e_20_3e_306',['vector< Point_< float > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20point_5f_3c_20int_20_3e_20_3e_307',['vector< Point_< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20predictresult_20_3e_308',['vector< PredictResult >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20ptr_3c_20trackertargetstate_20_3e_20_3e_309',['vector< Ptr< TrackerTargetState > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20quadedge_20_3e_310',['vector< QuadEdge >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20result_5ftype_20_3e_311',['vector< result_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20scalar_5f_3c_20double_20_3e_20_3e_312',['vector< Scalar_< double > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20size_5ft_20_3e_313',['vector< size_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20std_3a_3apair_3c_20_5fbiiter_2c_20int_20_3e_20_3e_314',['vector< std::pair< _BiIter, int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20std_3a_3apair_3c_20_5fstateidt_2c_20std_3a_3avector_20_3e_20_3e_315',['vector< std::pair< _StateIdT, std::vector > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20std_3a_3apair_3c_20_5fstrtranst_2c_20_5fstrtranst_20_3e_20_3e_316',['vector< std::pair< _StrTransT, _StrTransT > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20std_3a_3apair_3c_20int_2c_20int_20_3e_20_3e_317',['vector< std::pair< int, int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3apair_3c_20ptr_3c_20trackertargetstate_20_3e_2c_20float_20_3e_20_3e_318',['vector< std::pair< Ptr< TrackerTargetState >, float > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3ashared_5fptr_20_3e_319',['vector< std::shared_ptr >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3ashared_5fptr_3c_20cv_3a_3alinemod_3a_3amodality_20_3e_20_3e_320',['vector< std::shared_ptr< cv::linemod::Modality > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3ashared_5fptr_3c_20cv_3a_3atracker_20_3e_20_3e_321',['vector< std::shared_ptr< cv::Tracker > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3astring_20_3e_322',['vector< std::string >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3avector_20_3e_323',['vector< std::vector >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3avector_3c_20cv_3a_3apoint3_5f_20_3e_20_3e_324',['vector< std::vector< cv::Point3_ > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3avector_3c_20cv_3a_3arange_20_3e_20_3e_325',['vector< std::vector< cv::Range > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3avector_3c_20int_20_3e_20_3e_326',['vector< std::vector< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3avector_3c_20point_5f_3c_20int_20_3e_20_3e_20_3e_327',['vector< std::vector< Point_< int > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3avector_3c_20std_3a_3ashared_5fptr_3c_20cv_3a_3adatasets_3a_3aobject_20_3e_20_3e_20_3e_328',['vector< std::vector< std::shared_ptr< cv::datasets::Object > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_2c_20_5falloc_20_3e_329',['vector< sub_match< _Bi_iter >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_2c_20allocator_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_20_3e_20_3e_330',['vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20sub_5fmatch_3c_20_5fbiiter_20_3e_2c_20_5falloc_20_3e_331',['vector< sub_match< _BiIter >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20uchar_20_3e_332',['vector< uchar >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20uint8_5ft_20_2a_20_3e_333',['vector< uint8_t * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20vec_3c_20int_2c_203_20_3e_20_3e_334',['vector< Vec< int, 3 > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20cv_3a_3avec_3c_20int_2c_203_20_3e_20_3e_300',['vector< cv::Vec< int, 3 > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20double_20_3e_301',['vector< double >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< double >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'vector< double >']]], + ['vector_3c_20float_20_3e_302',['vector< float >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20garg_20_3e_303',['vector< GArg >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20gprotoarg_20_3e_304',['vector< GProtoArg >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20h264encoder_3a_3ax264_5fnal_5ft_5fsimple_20_3e_305',['vector< h264encoder::x264_nal_t_simple >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20int_20_3e_306',['vector< int >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< int >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'vector< int >']]], + ['vector_3c_20point_5f_3c_20float_20_3e_20_3e_307',['vector< Point_< float > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20point_5f_3c_20int_20_3e_20_3e_308',['vector< Point_< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20predictresult_20_3e_309',['vector< PredictResult >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20ptr_3c_20trackertargetstate_20_3e_20_3e_310',['vector< Ptr< TrackerTargetState > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20quadedge_20_3e_311',['vector< QuadEdge >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20result_5ftype_20_3e_312',['vector< result_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20scalar_5f_3c_20double_20_3e_20_3e_313',['vector< Scalar_< double > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20size_5ft_20_3e_314',['vector< size_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< size_t >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'vector< size_t >']]], + ['vector_3c_20std_3a_3apair_3c_20_5fbiiter_2c_20int_20_3e_20_3e_315',['vector< std::pair< _BiIter, int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20std_3a_3apair_3c_20_5fstateidt_2c_20std_3a_3avector_20_3e_20_3e_316',['vector< std::pair< _StateIdT, std::vector > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20std_3a_3apair_3c_20_5fstrtranst_2c_20_5fstrtranst_20_3e_20_3e_317',['vector< std::pair< _StrTransT, _StrTransT > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20std_3a_3apair_3c_20int_2c_20int_20_3e_20_3e_318',['vector< std::pair< int, int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3apair_3c_20ptr_3c_20trackertargetstate_20_3e_2c_20float_20_3e_20_3e_319',['vector< std::pair< Ptr< TrackerTargetState >, float > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3ashared_5fptr_20_3e_320',['vector< std::shared_ptr >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3ashared_5fptr_3c_20cv_3a_3alinemod_3a_3amodality_20_3e_20_3e_321',['vector< std::shared_ptr< cv::linemod::Modality > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3ashared_5fptr_3c_20cv_3a_3atracker_20_3e_20_3e_322',['vector< std::shared_ptr< cv::Tracker > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3astring_20_3e_323',['vector< std::string >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3avector_20_3e_324',['vector< std::vector >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3avector_3c_20cv_3a_3apoint3_5f_20_3e_20_3e_325',['vector< std::vector< cv::Point3_ > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3avector_3c_20cv_3a_3arange_20_3e_20_3e_326',['vector< std::vector< cv::Range > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3avector_3c_20int_20_3e_20_3e_327',['vector< std::vector< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3avector_3c_20point_5f_3c_20int_20_3e_20_3e_20_3e_328',['vector< std::vector< Point_< int > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3avector_3c_20std_3a_3ashared_5fptr_3c_20cv_3a_3adatasets_3a_3aobject_20_3e_20_3e_20_3e_329',['vector< std::vector< std::shared_ptr< cv::datasets::Object > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_2c_20_5falloc_20_3e_330',['vector< sub_match< _Bi_iter >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_2c_20allocator_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_20_3e_20_3e_331',['vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20sub_5fmatch_3c_20_5fbiiter_20_3e_2c_20_5falloc_20_3e_332',['vector< sub_match< _BiIter >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20uchar_20_3e_333',['vector< uchar >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20uint8_5ft_20_2a_20_3e_334',['vector< uint8_t * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], ['vector_3c_20vertex_20_3e_335',['vector< Vertex >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], ['vectorblock_336',['VectorBlock',['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorBlock.html',1,'Eigen::VectorBlock< class, Size >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorBlock.html#a2364b6e64015c451ed93b68d39eaeffd',1,'Eigen::VectorBlock::VectorBlock(VectorType &vector, Index start)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorBlock.html#a11a5f0478de60b9cd8c15faf6dbc5baf',1,'Eigen::VectorBlock::VectorBlock(VectorType &vector, Index start, Index size)']]], ['vectord_337',['vectorD',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#af60b2f826a38a00070e0efccf0572066',1,'Eigen::LDLT::vectorD()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a5ce93133b485996d477db4eb2b32fb32',1,'Eigen::SimplicialLDLT::vectorD()']]], @@ -404,11 +404,11 @@ var searchData= ['verbosity_5flevel_401',['verbosity_level',['https://docs.opencv.org/4.2.0/d1/d61/classcv_1_1sfm_1_1libmv__ReconstructionOptions.html#a53121aaf46050c0340df1fdce3ae3d67',1,'cv::sfm::libmv_ReconstructionOptions']]], ['version_402',['version',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab0aecc1d52f02547ba0cf6cba000fb8c',1,'cv::ocl::Device::version()'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#a958a7f120776958fbd4db122942b2483',1,'cv::ocl::PlatformInfo::version()']]], ['version_202_2014_201_20and_20cmake_20version_203_209_201_403',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], - ['version_205_404',['Hierarchical Data Format version 5',['https://docs.opencv.org/4.2.0/d6/dee/group__hdf5.html',1,'']]], - ['version_2ehpp_405',['version.hpp',['https://docs.opencv.org/4.2.0/da/dd7/core_2include_2opencv2_2core_2version_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d1a/dnn_2include_2opencv2_2dnn_2version_8hpp.html',1,'(Global Namespace)']]], - ['vertex_406',['vertex',['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html',1,'cv::multicalib::MultiCameraCalibration']]], + ['version_203_209_201_404',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['version_205_405',['Hierarchical Data Format version 5',['https://docs.opencv.org/4.2.0/d6/dee/group__hdf5.html',1,'']]], + ['version_2ehpp_406',['version.hpp',['https://docs.opencv.org/4.2.0/da/dd7/core_2include_2opencv2_2core_2version_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d1a/dnn_2include_2opencv2_2dnn_2version_8hpp.html',1,'(Global Namespace)']]], ['vertex_407',['Vertex',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html',1,'cv::Subdiv2D::Vertex'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a7f3d045d41906eeacd1633b9a749204f',1,'cv::Subdiv2D::Vertex::Vertex()'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a12c40028fe38c6f0bba619cd9b12d7c7',1,'cv::Subdiv2D::Vertex::Vertex(Point2f pt, bool _isvirtual, int _firstEdge=0)']]], - ['vertex_408',['vertex',['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html#afaac285a2d794638750202b98f7dbb57',1,'cv::multicalib::MultiCameraCalibration::vertex::vertex(Mat po, int ts)'],['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html#ae16c38eafe2916c197f4ad1da4047e90',1,'cv::multicalib::MultiCameraCalibration::vertex::vertex()']]], + ['vertex_408',['vertex',['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html',1,'cv::multicalib::MultiCameraCalibration::vertex'],['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html#afaac285a2d794638750202b98f7dbb57',1,'cv::multicalib::MultiCameraCalibration::vertex::vertex(Mat po, int ts)'],['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html#ae16c38eafe2916c197f4ad1da4047e90',1,'cv::multicalib::MultiCameraCalibration::vertex::vertex()']]], ['vertexgain_409',['vertexGain',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#adfff686c58a20a830ca40a258e6a8ca3',1,'cv::CirclesGridFinderParameters']]], ['vertexpenalty_410',['vertexPenalty',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#ac04410758f6fa3d7a295aabd4e63f4ed',1,'cv::CirclesGridFinderParameters']]], ['vertical_411',['Vertical',['https://eigen.tuxfamily.org/dox/group__enums.html#ggad49a7b3738e273eb00932271b36127f7ae2efac6e74ecab5e3b0b1561c5ddf83e',1,'Eigen::Vertical'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggad49a7b3738e273eb00932271b36127f7ae2efac6e74ecab5e3b0b1561c5ddf83e',1,'Vertical(Global Namespace)']]], @@ -424,106 +424,105 @@ var searchData= ['video_20analysis_20video_20module_421',['Video analysis (video module)',['https://docs.opencv.org/4.2.0/da/dd0/tutorial_table_of_content_video.html',1,'']]], ['video_20capture_422',['Video Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'Face Detection in Video Capture'],['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'Image Processing for Video Capture']]], ['video_20encoding_20decoding_423',['Video Encoding/Decoding',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html',1,'']]], - ['video_20i_20o_424',['video I O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__c.html',1,'C API for video I/O'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html',1,'Flags for video I/O'],['https://docs.opencv.org/4.2.0/d5/d26/group__videoio__ios.html',1,'iOS glue for video I/O']]], - ['video_20i_20o_425',['Video I/O',['https://docs.opencv.org/4.2.0/dd/de7/group__videoio.html',1,'']]], - ['video_20i_20o_426',['WinRT glue for video I/O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html',1,'']]], - ['video_20i_20o_20api_20backends_427',['Additional flags for video I/O API backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'']]], - ['video_20i_20o_20with_20opencv_20overview_428',['Video I/O with OpenCV Overview',['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'']]], - ['video_20input_20and_20output_20videoio_20module_429',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], - ['video_20input_20with_20opencv_20and_20similarity_20measurement_430',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], - ['video_20module_431',['Video analysis (video module)',['https://docs.opencv.org/4.2.0/da/dd0/tutorial_table_of_content_video.html',1,'']]], - ['video_20processing_432',['OpenCV iOS - Video Processing',['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'']]], - ['video_20stabilization_433',['Video Stabilization',['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html',1,'']]], - ['video_20with_20opencv_434',['Creating a video with OpenCV',['https://docs.opencv.org/4.2.0/d7/d9e/tutorial_video_write.html',1,'']]], - ['video_2ehpp_435',['video.hpp',['https://docs.opencv.org/4.2.0/da/dbe/video_2video_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/d71/video_8hpp.html',1,'(Global Namespace)']]], - ['video_5finput_5fpsnr_5fssim_2emarkdown_436',['video_input_psnr_ssim.markdown',['https://docs.opencv.org/4.2.0/da/dcb/video__input__psnr__ssim_8markdown.html',1,'']]], - ['video_5fprocessing_2emarkdown_437',['video_processing.markdown',['https://docs.opencv.org/4.2.0/d9/d45/video__processing_8markdown.html',1,'']]], - ['video_5fwrite_2emarkdown_438',['video_write.markdown',['https://docs.opencv.org/4.2.0/d1/d98/video__write_8markdown.html',1,'']]], - ['videocapture_439',['VideoCapture',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html',1,'cv::VideoCapture'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a57c0e81e83e60f36c83027dc2a188e80',1,'cv::VideoCapture::VideoCapture()'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#ac4107fb146a762454a8a87715d9b7c96',1,'cv::VideoCapture::VideoCapture(const String &filename, int apiPreference=CAP_ANY)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#aabce0d83aa0da9af802455e8cf5fd181',1,'cv::VideoCapture::VideoCapture(int index, int apiPreference=CAP_ANY)']]], - ['videocaptureapis_440',['VideoCaptureAPIs',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ga023786be1ee68a9105bf2e48c700294d',1,'cv::VideoCaptureAPIs'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ga023786be1ee68a9105bf2e48c700294d',1,'VideoCaptureAPIs(Global Namespace)']]], - ['videocaptureconnection_441',['videoCaptureConnection',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a8589c194220aff69cffeb8a363af2f94',1,'CvAbstractCamera']]], - ['videocaptureproperties_442',['VideoCaptureProperties',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gaeb8dd9c89c10a5c63c139bf7c4f5704d',1,'cv::VideoCaptureProperties'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gaeb8dd9c89c10a5c63c139bf7c4f5704d',1,'VideoCaptureProperties(Global Namespace)']]], - ['videodataoutput_443',['videoDataOutput',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#ab0f5857858359cba2580c21de5bc19dd',1,'CvVideoCamera']]], - ['videodataoutputqueue_444',['videoDataOutputQueue',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#a4b2bec06f6cd2ee1002dea79d95030df',1,'CvVideoCamera']]], - ['videofilesource_445',['VideoFileSource',['https://docs.opencv.org/4.2.0/da/d0b/classcv_1_1videostab_1_1VideoFileSource.html',1,'cv::videostab::VideoFileSource'],['https://docs.opencv.org/4.2.0/da/d0b/classcv_1_1videostab_1_1VideoFileSource.html#a3b656c713663818b2a478c1ff3b1d9a2',1,'cv::videostab::VideoFileSource::VideoFileSource()']]], - ['videofilestring_446',['videoFileString',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#af83b57050823a39df21fda384868f7aa',1,'CvVideoCamera']]], - ['videofileurl_447',['videoFileURL',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#a9f7b8533943deeb5fd6122a4900fb2aa',1,'CvVideoCamera']]], - ['videoio_20module_448',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], - ['videoio_2ehpp_449',['videoio.hpp',['https://docs.opencv.org/4.2.0/d8/d8e/videoio_2videoio_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d3d/videoio_8hpp.html',1,'(Global Namespace)']]], - ['videoio_5foverview_2emarkdown_450',['videoio_overview.markdown',['https://docs.opencv.org/4.2.0/dd/de3/videoio__overview_8markdown.html',1,'']]], - ['videoname_451',['videoName',['https://docs.opencv.org/4.2.0/d1/da9/structcv_1_1datasets_1_1AR__hmdbObj.html#ab9b394afc4877aa2a46e7181c3c17b96',1,'cv::datasets::AR_hmdbObj']]], - ['videoreader_452',['VideoReader',['https://docs.opencv.org/4.2.0/db/ded/classcv_1_1cudacodec_1_1VideoReader.html',1,'cv::cudacodec']]], - ['videos_453',['Videos',['https://docs.opencv.org/4.2.0/dd/d43/tutorial_py_video_display.html',1,'Getting Started with Videos'],['https://docs.opencv.org/4.2.0/dd/d00/tutorial_js_video_display.html',1,'Getting Started with Videos']]], - ['videostab_2ehpp_454',['videostab.hpp',['https://docs.opencv.org/4.2.0/dd/d91/videostab_8hpp.html',1,'']]], - ['videourl_455',['videoUrl',['https://docs.opencv.org/4.2.0/d0/dec/structcv_1_1datasets_1_1AR__sportsObj.html#a36bc1130c372793e4e27880a06037779',1,'cv::datasets::AR_sportsObj']]], - ['videowriter_456',['VideoWriter',['https://docs.opencv.org/4.2.0/df/dde/classcv_1_1cudacodec_1_1VideoWriter.html',1,'cv::cudacodec::VideoWriter'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html',1,'cv::VideoWriter'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#ad59c61d8881ba2b2da22cff5487465b5',1,'cv::VideoWriter::VideoWriter()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#ac3478f6257454209fa99249cc03a5c59',1,'cv::VideoWriter::VideoWriter(const String &filename, int fourcc, double fps, Size frameSize, bool isColor=true)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#af52d129e2430c0287654e7d24e3bbcdc',1,'cv::VideoWriter::VideoWriter(const String &filename, int apiPreference, int fourcc, double fps, Size frameSize, bool isColor=true)']]], - ['videowriter_5fprop_5fframebytes_457',['VIDEOWRITER_PROP_FRAMEBYTES',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga41c5cfa7859ae542b71b1d33bbd4d2b4ace3320e146f4f95f3d58b32b0e1237b1',1,'cv::VIDEOWRITER_PROP_FRAMEBYTES'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga41c5cfa7859ae542b71b1d33bbd4d2b4ace3320e146f4f95f3d58b32b0e1237b1',1,'VIDEOWRITER_PROP_FRAMEBYTES(Global Namespace)']]], - ['videowriter_5fprop_5fnstripes_458',['VIDEOWRITER_PROP_NSTRIPES',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga41c5cfa7859ae542b71b1d33bbd4d2b4ae8e8348e4b6b8c78d9921c65c91a8e10',1,'cv::VIDEOWRITER_PROP_NSTRIPES'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga41c5cfa7859ae542b71b1d33bbd4d2b4ae8e8348e4b6b8c78d9921c65c91a8e10',1,'VIDEOWRITER_PROP_NSTRIPES(Global Namespace)']]], - ['videowriter_5fprop_5fquality_459',['VIDEOWRITER_PROP_QUALITY',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga41c5cfa7859ae542b71b1d33bbd4d2b4a1cc2ab47f60a115ff9624ff71715b93b',1,'cv::VIDEOWRITER_PROP_QUALITY'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga41c5cfa7859ae542b71b1d33bbd4d2b4a1cc2ab47f60a115ff9624ff71715b93b',1,'VIDEOWRITER_PROP_QUALITY(Global Namespace)']]], - ['videowriterproperties_460',['VideoWriterProperties',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ga41c5cfa7859ae542b71b1d33bbd4d2b4',1,'cv::VideoWriterProperties'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ga41c5cfa7859ae542b71b1d33bbd4d2b4',1,'VideoWriterProperties(Global Namespace)']]], - ['view_461',['View',['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html',1,'cv::gapi::fluid::View'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#ae6e3589d13f1e6ad46ebaf0ed317ef87',1,'cv::gapi::fluid::View::View()=default'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#af07708bcac21f862c2bccd29fa4de792',1,'cv::gapi::fluid::View::View(Priv *p)']]], - ['viewascholmod_462',['viewAsCholmod',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#afacb818b18280e2e1ab73836ab74cab5',1,'Eigen::viewAsCholmod(const SparseSelfAdjointView< const SparseMatrix< _Scalar, _Options, _Index >, UpLo > &mat)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a92fe7b595099051fa1d1c443641a6de3',1,'Eigen::viewAsCholmod(MatrixBase< Derived > &mat)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ac9fb9e40cfc9ddbdc7da84ee01bb7545',1,'Eigen::viewAsCholmod(Ref< SparseMatrix< _Scalar, _Options, _StorageIndex > > mat)']]], - ['viewaseigen_463',['viewAsEigen',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#aad43574b96b756041bd8037c4b61e0d9',1,'Eigen']]], - ['viewing_20in_20memory_20images_20in_20the_20visual_20studio_20debugger_464',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['violet_465',['violet',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#af7f466d5ef0423ae986ff78c69a4a348',1,'cv::viz::Color']]], - ['vision_466',['CUDA-accelerated Computer Vision',['https://docs.opencv.org/4.2.0/d1/d1e/group__cuda.html',1,'']]], - ['vision_467',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], - ['vision_20applications_468',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], - ['vision_20cuda_20module_469',['GPU-Accelerated Computer Vision (cuda module)',['https://docs.opencv.org/4.2.0/da/d2c/tutorial_table_of_content_gpu.html',1,'']]], - ['vision_20models_20and_20derivated_20tools_470',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], - ['vision_20programs_471',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], - ['visit_472',['visit',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a4225b90fcc74f18dd479b401124b3841',1,'Eigen::DenseBase::visit()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a4225b90fcc74f18dd479b401124b3841',1,'DenseBase< ArrayWrapper< ExpressionType > >::visit()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a4225b90fcc74f18dd479b401124b3841',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::visit()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a4225b90fcc74f18dd479b401124b3841',1,'DenseBase< Solve< Decomposition, RhsType > >::visit()']]], - ['visitors_20and_20broadcasting_473',['Reductions, visitors and broadcasting',['https://eigen.tuxfamily.org/dox/group__TutorialReductionsVisitorsBroadcasting.html',1,'']]], - ['visual_20debugging_20of_20computer_20vision_20applications_474',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], - ['visual_20debugging_20of_20computer_20vision_20programs_475',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], - ['visual_20studio_476',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['visual_20studio_20debugger_477',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['visual_5fdebugging_5fintroduction_2emarkdown_478',['visual_debugging_introduction.markdown',['https://docs.opencv.org/4.2.0/db/de0/visual__debugging__introduction_8markdown.html',1,'']]], - ['visualiser_479',['OGRE 3D Visualiser',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html',1,'']]], - ['visualizer_480',['3D Visualizer',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html',1,'']]], - ['viz_481',['Viz',['https://docs.opencv.org/4.2.0/d5/d7d/tutorial_launching_viz.html',1,'Launching Viz'],['https://docs.opencv.org/4.2.0/d7/df9/tutorial_table_of_content_viz.html',1,'OpenCV Viz']]], - ['viz_2ehpp_482',['viz.hpp',['https://docs.opencv.org/4.2.0/d0/d7e/viz_8hpp.html',1,'']]], - ['viz3d_483',['Viz3d',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html',1,'cv::viz::Viz3d'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#ad8f8cf39ab7d75e85686b38742b5a567',1,'cv::viz::Viz3d::Viz3d(const String &window_name=String())'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#aceda98bd840ed352c1993b6b425970da',1,'cv::viz::Viz3d::Viz3d(const Viz3d &)']]], - ['viz3d_2ehpp_484',['viz3d.hpp',['https://docs.opencv.org/4.2.0/de/d82/viz3d_8hpp.html',1,'']]], - ['vizcore_2ehpp_485',['vizcore.hpp',['https://docs.opencv.org/4.2.0/d2/d4b/vizcore_8hpp.html',1,'']]], - ['vizstorage_486',['VizStorage',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#ac45aed87eab7bc5de73cd22660f689a5',1,'cv::viz::Viz3d']]], - ['vmax2_487',['vmax2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb74fef161b3a8547118b23f603012d',1,'cv::cudev::vmax2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb74fef161b3a8547118b23f603012d',1,'vmax2()(Global Namespace)']]], - ['vmax4_488',['vmax4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac65f79fa4274b6cd38b7b5a1b12a8671',1,'cv::cudev::vmax4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac65f79fa4274b6cd38b7b5a1b12a8671',1,'vmax4()(Global Namespace)']]], - ['vmin2_489',['vmin2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3876e8efa35fa14a0cda1711ab53bd09',1,'cv::cudev::vmin2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3876e8efa35fa14a0cda1711ab53bd09',1,'vmin2()(Global Namespace)']]], - ['vmin4_490',['vmin4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafba0d98f53518d1e4b18eee07cc7f267',1,'cv::cudev::vmin4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafba0d98f53518d1e4b18eee07cc7f267',1,'vmin4()(Global Namespace)']]], - ['vocabulary_491',['vocabulary',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#ab5753a53d4f4c6e2c18b61e1b4559b98',1,'cv::BOWImgDescriptorExtractor::vocabulary'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a13e4d550f8fd132008b511ed8ec23a02',1,'cv::text::OCRBeamSearchDecoder::vocabulary'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a6e0e274c31f74ece9e5adeaf108e192b',1,'cv::text::OCRHMMDecoder::vocabulary']]], - ['void_5fpointer_492',['void_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a242e530b7ee8e5d17a017983cc7cc705',1,'__alloc_traits< _Tp_alloc_type >::void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a242e530b7ee8e5d17a017983cc7cc705',1,'__gnu_cxx::__alloc_traits::void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a242e530b7ee8e5d17a017983cc7cc705',1,'allocator_traits< _Tp_alloc_type >::void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a242e530b7ee8e5d17a017983cc7cc705',1,'std::allocator_traits::void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a2e58512fe31588cbb360b60a98190bf9',1,'std::allocator_traits< allocator< _Tp > >::void_pointer']]], - ['void_5ft_493',['void_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga22cbeb48987e9b7ee87a626eb5f1d6dc',1,'std::void_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga22cbeb48987e9b7ee87a626eb5f1d6dc',1,'void_t(Global Namespace)']]], - ['volume_494',['volume',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae048c23dc498b5012a080737e5b1d1c3',1,'Eigen::AlignedBox']]], - ['volumedims_495',['volumeDims',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a82ed5f3eee544b3ff53e4859df072e00',1,'cv::dynafu::Params::volumeDims'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#ada2bc66d79391a2ba67088ca0c75c9a6',1,'cv::kinfu::Params::volumeDims']]], - ['volumepose_496',['volumePose',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#aa80f027f90a86a3f234fb9d66f37bcc3',1,'cv::dynafu::Params::volumePose'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a3110d770b32084c3ab11f61233c23511',1,'cv::kinfu::Params::volumePose']]], - ['voronoi_5fseam_497',['VORONOI_SEAM',['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html#aa8c4c8cb01e15b4652116630d93c3eb2a55b2503305e94168c0b36c4531f288d7',1,'cv::detail::SeamFinder']]], - ['voronoiseamfinder_498',['VoronoiSeamFinder',['https://docs.opencv.org/4.2.0/db/d24/classcv_1_1detail_1_1VoronoiSeamFinder.html',1,'cv::detail']]], - ['voxelsize_499',['voxelSize',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a5b7a5f8b2669d3cbbd25912a0f2504ff',1,'cv::dynafu::Params::voxelSize'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a07d4de260fdeba606365332c782bbb0a',1,'cv::kinfu::Params::voxelSize']]], - ['vp8_500',['VP8',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146ab61d17461bd84c700fa8931e4264af88',1,'cv::cudacodec::VP8'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146ab61d17461bd84c700fa8931e4264af88',1,'VP8(Global Namespace)']]], - ['vp9_501',['VP9',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146af9085ed76f0b9089ae0039bd3edc3bf8',1,'cv::cudacodec::VP9'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146af9085ed76f0b9089ae0039bd3edc3bf8',1,'VP9(Global Namespace)']]], - ['vscale_502',['vscale',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a78522baddc2942ba4fb5281c8e7869f4',1,'cv::QtFont']]], - ['vscroll_503',['VScroll',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#ada240f2528500ad1615e76fb2fd9e2baabbfe491796298420cd5eefc79fb2ed17',1,'cv::viz::MouseEvent']]], - ['vseteq2_504',['vseteq2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01ff15b2b7c1d0685620454423dde88e',1,'cv::cudev::vseteq2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01ff15b2b7c1d0685620454423dde88e',1,'vseteq2()(Global Namespace)']]], - ['vseteq4_505',['vseteq4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36f692aef5c8080cb8960b46b14f96e3',1,'cv::cudev::vseteq4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36f692aef5c8080cb8960b46b14f96e3',1,'vseteq4()(Global Namespace)']]], - ['vsetge2_506',['vsetge2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6917a10dd7bc10547c31cfcb5e76675c',1,'cv::cudev::vsetge2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6917a10dd7bc10547c31cfcb5e76675c',1,'vsetge2()(Global Namespace)']]], - ['vsetge4_507',['vsetge4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59bddb10bcef75d257c5ebe2e7b04b7d',1,'cv::cudev::vsetge4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59bddb10bcef75d257c5ebe2e7b04b7d',1,'vsetge4()(Global Namespace)']]], - ['vsetgt2_508',['vsetgt2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f33a6b3237e708124c4564b84c6848',1,'cv::cudev::vsetgt2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f33a6b3237e708124c4564b84c6848',1,'vsetgt2()(Global Namespace)']]], - ['vsetgt4_509',['vsetgt4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga047b4a6f5b5b33d11cebe5d1a3de98d3',1,'cv::cudev::vsetgt4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga047b4a6f5b5b33d11cebe5d1a3de98d3',1,'vsetgt4()(Global Namespace)']]], - ['vsetle2_510',['vsetle2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdc0c57f0ad835fd61d7ddfe4ae33e4b',1,'cv::cudev::vsetle2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdc0c57f0ad835fd61d7ddfe4ae33e4b',1,'vsetle2()(Global Namespace)']]], - ['vsetle4_511',['vsetle4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5750754e7e85345d8efd89a35e6866d3',1,'cv::cudev::vsetle4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5750754e7e85345d8efd89a35e6866d3',1,'vsetle4()(Global Namespace)']]], - ['vsetlt2_512',['vsetlt2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf34d0415531e6b94721c4dd48b0025fe',1,'cv::cudev::vsetlt2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf34d0415531e6b94721c4dd48b0025fe',1,'vsetlt2()(Global Namespace)']]], - ['vsetlt4_513',['vsetlt4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga856c6fa9bf9db87aee51fec4a8cb9a28',1,'cv::cudev::vsetlt4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga856c6fa9bf9db87aee51fec4a8cb9a28',1,'vsetlt4()(Global Namespace)']]], - ['vsetne2_514',['vsetne2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae44f99094f082fd1151dba42df0c7fda',1,'cv::cudev::vsetne2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae44f99094f082fd1151dba42df0c7fda',1,'vsetne2()(Global Namespace)']]], - ['vsetne4_515',['vsetne4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae33c04148c2053a7a65c81a98b1f9618',1,'cv::cudev::vsetne4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae33c04148c2053a7a65c81a98b1f9618',1,'vsetne4(uint a, uint b)(Global Namespace)']]], - ['vstring_2eh_516',['vstring.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01103.html',1,'']]], - ['vstring_2etcc_517',['vstring.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01106.html',1,'']]], - ['vstring_5ffwd_2eh_518',['vstring_fwd.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01109.html',1,'']]], - ['vstring_5futil_2eh_519',['vstring_util.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01112.html',1,'']]], - ['vsub2_520',['vsub2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9984e5765f6214960ecee677531e207',1,'cv::cudev::vsub2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9984e5765f6214960ecee677531e207',1,'vsub2()(Global Namespace)']]], - ['vsub4_521',['vsub4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga678156de6871de69a5f16364b0243cfe',1,'cv::cudev::vsub4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga678156de6871de69a5f16364b0243cfe',1,'vsub4(uint a, uint b)(Global Namespace)']]], - ['vsx_20utilities_522',['VSX utilities',['https://docs.opencv.org/4.2.0/d3/d50/group__core__utils__vsx.html',1,'']]], - ['vsx_5futils_2ehpp_523',['vsx_utils.hpp',['https://docs.opencv.org/4.2.0/db/d68/vsx__utils_8hpp.html',1,'']]], - ['vt_524',['vt',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#ab1971bad7d11ee9be67e23651fc0241c',1,'cv::SVD']]], - ['vtx_525',['vtx',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aebc53cc84655eb0eb8420e26457c6b34',1,'cv::Subdiv2D']]] + ['video_20i_20o_424',['Video I/O',['https://docs.opencv.org/4.2.0/dd/de7/group__videoio.html',1,'']]], + ['video_20i_20o_425',['video I O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__c.html',1,'C API for video I/O'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html',1,'Flags for video I/O'],['https://docs.opencv.org/4.2.0/d5/d26/group__videoio__ios.html',1,'iOS glue for video I/O'],['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html',1,'WinRT glue for video I/O']]], + ['video_20i_20o_20api_20backends_426',['Additional flags for video I/O API backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'']]], + ['video_20i_20o_20with_20opencv_20overview_427',['Video I/O with OpenCV Overview',['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'']]], + ['video_20input_20and_20output_20videoio_20module_428',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], + ['video_20input_20with_20opencv_20and_20similarity_20measurement_429',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], + ['video_20module_430',['Video analysis (video module)',['https://docs.opencv.org/4.2.0/da/dd0/tutorial_table_of_content_video.html',1,'']]], + ['video_20processing_431',['OpenCV iOS - Video Processing',['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'']]], + ['video_20stabilization_432',['Video Stabilization',['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html',1,'']]], + ['video_20with_20opencv_433',['Creating a video with OpenCV',['https://docs.opencv.org/4.2.0/d7/d9e/tutorial_video_write.html',1,'']]], + ['video_2ehpp_434',['video.hpp',['https://docs.opencv.org/4.2.0/da/dbe/video_2video_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/d71/video_8hpp.html',1,'(Global Namespace)']]], + ['video_5finput_5fpsnr_5fssim_2emarkdown_435',['video_input_psnr_ssim.markdown',['https://docs.opencv.org/4.2.0/da/dcb/video__input__psnr__ssim_8markdown.html',1,'']]], + ['video_5fprocessing_2emarkdown_436',['video_processing.markdown',['https://docs.opencv.org/4.2.0/d9/d45/video__processing_8markdown.html',1,'']]], + ['video_5fwrite_2emarkdown_437',['video_write.markdown',['https://docs.opencv.org/4.2.0/d1/d98/video__write_8markdown.html',1,'']]], + ['videocapture_438',['VideoCapture',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html',1,'cv::VideoCapture'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a57c0e81e83e60f36c83027dc2a188e80',1,'cv::VideoCapture::VideoCapture()'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#ac4107fb146a762454a8a87715d9b7c96',1,'cv::VideoCapture::VideoCapture(const String &filename, int apiPreference=CAP_ANY)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#aabce0d83aa0da9af802455e8cf5fd181',1,'cv::VideoCapture::VideoCapture(int index, int apiPreference=CAP_ANY)']]], + ['videocaptureapis_439',['VideoCaptureAPIs',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ga023786be1ee68a9105bf2e48c700294d',1,'cv::VideoCaptureAPIs'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ga023786be1ee68a9105bf2e48c700294d',1,'VideoCaptureAPIs(Global Namespace)']]], + ['videocaptureconnection_440',['videoCaptureConnection',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a8589c194220aff69cffeb8a363af2f94',1,'CvAbstractCamera']]], + ['videocaptureproperties_441',['VideoCaptureProperties',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gaeb8dd9c89c10a5c63c139bf7c4f5704d',1,'cv::VideoCaptureProperties'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gaeb8dd9c89c10a5c63c139bf7c4f5704d',1,'VideoCaptureProperties(Global Namespace)']]], + ['videodataoutput_442',['videoDataOutput',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#ab0f5857858359cba2580c21de5bc19dd',1,'CvVideoCamera']]], + ['videodataoutputqueue_443',['videoDataOutputQueue',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#a4b2bec06f6cd2ee1002dea79d95030df',1,'CvVideoCamera']]], + ['videofilesource_444',['VideoFileSource',['https://docs.opencv.org/4.2.0/da/d0b/classcv_1_1videostab_1_1VideoFileSource.html',1,'cv::videostab::VideoFileSource'],['https://docs.opencv.org/4.2.0/da/d0b/classcv_1_1videostab_1_1VideoFileSource.html#a3b656c713663818b2a478c1ff3b1d9a2',1,'cv::videostab::VideoFileSource::VideoFileSource()']]], + ['videofilestring_445',['videoFileString',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#af83b57050823a39df21fda384868f7aa',1,'CvVideoCamera']]], + ['videofileurl_446',['videoFileURL',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#a9f7b8533943deeb5fd6122a4900fb2aa',1,'CvVideoCamera']]], + ['videoio_20module_447',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], + ['videoio_2ehpp_448',['videoio.hpp',['https://docs.opencv.org/4.2.0/d8/d8e/videoio_2videoio_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d3d/videoio_8hpp.html',1,'(Global Namespace)']]], + ['videoio_5foverview_2emarkdown_449',['videoio_overview.markdown',['https://docs.opencv.org/4.2.0/dd/de3/videoio__overview_8markdown.html',1,'']]], + ['videoname_450',['videoName',['https://docs.opencv.org/4.2.0/d1/da9/structcv_1_1datasets_1_1AR__hmdbObj.html#ab9b394afc4877aa2a46e7181c3c17b96',1,'cv::datasets::AR_hmdbObj']]], + ['videoreader_451',['VideoReader',['https://docs.opencv.org/4.2.0/db/ded/classcv_1_1cudacodec_1_1VideoReader.html',1,'cv::cudacodec']]], + ['videos_452',['Videos',['https://docs.opencv.org/4.2.0/dd/d43/tutorial_py_video_display.html',1,'Getting Started with Videos'],['https://docs.opencv.org/4.2.0/dd/d00/tutorial_js_video_display.html',1,'Getting Started with Videos']]], + ['videostab_2ehpp_453',['videostab.hpp',['https://docs.opencv.org/4.2.0/dd/d91/videostab_8hpp.html',1,'']]], + ['videourl_454',['videoUrl',['https://docs.opencv.org/4.2.0/d0/dec/structcv_1_1datasets_1_1AR__sportsObj.html#a36bc1130c372793e4e27880a06037779',1,'cv::datasets::AR_sportsObj']]], + ['videowriter_455',['VideoWriter',['https://docs.opencv.org/4.2.0/df/dde/classcv_1_1cudacodec_1_1VideoWriter.html',1,'cv::cudacodec::VideoWriter'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html',1,'cv::VideoWriter'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#ad59c61d8881ba2b2da22cff5487465b5',1,'cv::VideoWriter::VideoWriter()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#ac3478f6257454209fa99249cc03a5c59',1,'cv::VideoWriter::VideoWriter(const String &filename, int fourcc, double fps, Size frameSize, bool isColor=true)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#af52d129e2430c0287654e7d24e3bbcdc',1,'cv::VideoWriter::VideoWriter(const String &filename, int apiPreference, int fourcc, double fps, Size frameSize, bool isColor=true)']]], + ['videowriter_5fprop_5fframebytes_456',['VIDEOWRITER_PROP_FRAMEBYTES',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga41c5cfa7859ae542b71b1d33bbd4d2b4ace3320e146f4f95f3d58b32b0e1237b1',1,'cv::VIDEOWRITER_PROP_FRAMEBYTES'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga41c5cfa7859ae542b71b1d33bbd4d2b4ace3320e146f4f95f3d58b32b0e1237b1',1,'VIDEOWRITER_PROP_FRAMEBYTES(Global Namespace)']]], + ['videowriter_5fprop_5fnstripes_457',['VIDEOWRITER_PROP_NSTRIPES',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga41c5cfa7859ae542b71b1d33bbd4d2b4ae8e8348e4b6b8c78d9921c65c91a8e10',1,'cv::VIDEOWRITER_PROP_NSTRIPES'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga41c5cfa7859ae542b71b1d33bbd4d2b4ae8e8348e4b6b8c78d9921c65c91a8e10',1,'VIDEOWRITER_PROP_NSTRIPES(Global Namespace)']]], + ['videowriter_5fprop_5fquality_458',['VIDEOWRITER_PROP_QUALITY',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga41c5cfa7859ae542b71b1d33bbd4d2b4a1cc2ab47f60a115ff9624ff71715b93b',1,'cv::VIDEOWRITER_PROP_QUALITY'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga41c5cfa7859ae542b71b1d33bbd4d2b4a1cc2ab47f60a115ff9624ff71715b93b',1,'VIDEOWRITER_PROP_QUALITY(Global Namespace)']]], + ['videowriterproperties_459',['VideoWriterProperties',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ga41c5cfa7859ae542b71b1d33bbd4d2b4',1,'cv::VideoWriterProperties'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ga41c5cfa7859ae542b71b1d33bbd4d2b4',1,'VideoWriterProperties(Global Namespace)']]], + ['view_460',['View',['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html',1,'cv::gapi::fluid::View'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#ae6e3589d13f1e6ad46ebaf0ed317ef87',1,'cv::gapi::fluid::View::View()=default'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#af07708bcac21f862c2bccd29fa4de792',1,'cv::gapi::fluid::View::View(Priv *p)']]], + ['viewascholmod_461',['viewAsCholmod',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#afacb818b18280e2e1ab73836ab74cab5',1,'Eigen::viewAsCholmod(const SparseSelfAdjointView< const SparseMatrix< _Scalar, _Options, _Index >, UpLo > &mat)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a92fe7b595099051fa1d1c443641a6de3',1,'Eigen::viewAsCholmod(MatrixBase< Derived > &mat)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ac9fb9e40cfc9ddbdc7da84ee01bb7545',1,'Eigen::viewAsCholmod(Ref< SparseMatrix< _Scalar, _Options, _StorageIndex > > mat)']]], + ['viewaseigen_462',['viewAsEigen',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#aad43574b96b756041bd8037c4b61e0d9',1,'Eigen']]], + ['viewing_20in_20memory_20images_20in_20the_20visual_20studio_20debugger_463',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['violet_464',['violet',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#af7f466d5ef0423ae986ff78c69a4a348',1,'cv::viz::Color']]], + ['vision_465',['CUDA-accelerated Computer Vision',['https://docs.opencv.org/4.2.0/d1/d1e/group__cuda.html',1,'']]], + ['vision_466',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], + ['vision_20applications_467',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], + ['vision_20cuda_20module_468',['GPU-Accelerated Computer Vision (cuda module)',['https://docs.opencv.org/4.2.0/da/d2c/tutorial_table_of_content_gpu.html',1,'']]], + ['vision_20models_20and_20derivated_20tools_469',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], + ['vision_20programs_470',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], + ['visit_471',['visit',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a4225b90fcc74f18dd479b401124b3841',1,'Eigen::DenseBase::visit()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a4225b90fcc74f18dd479b401124b3841',1,'DenseBase< ArrayWrapper< ExpressionType > >::visit()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a4225b90fcc74f18dd479b401124b3841',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::visit()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a4225b90fcc74f18dd479b401124b3841',1,'DenseBase< Solve< Decomposition, RhsType > >::visit()']]], + ['visitors_20and_20broadcasting_472',['Reductions, visitors and broadcasting',['https://eigen.tuxfamily.org/dox/group__TutorialReductionsVisitorsBroadcasting.html',1,'']]], + ['visual_20debugging_20of_20computer_20vision_20applications_473',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], + ['visual_20debugging_20of_20computer_20vision_20programs_474',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], + ['visual_20studio_475',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['visual_20studio_20debugger_476',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['visual_5fdebugging_5fintroduction_2emarkdown_477',['visual_debugging_introduction.markdown',['https://docs.opencv.org/4.2.0/db/de0/visual__debugging__introduction_8markdown.html',1,'']]], + ['visualiser_478',['OGRE 3D Visualiser',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html',1,'']]], + ['visualizer_479',['3D Visualizer',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html',1,'']]], + ['viz_480',['Viz',['https://docs.opencv.org/4.2.0/d5/d7d/tutorial_launching_viz.html',1,'Launching Viz'],['https://docs.opencv.org/4.2.0/d7/df9/tutorial_table_of_content_viz.html',1,'OpenCV Viz']]], + ['viz_2ehpp_481',['viz.hpp',['https://docs.opencv.org/4.2.0/d0/d7e/viz_8hpp.html',1,'']]], + ['viz3d_482',['Viz3d',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html',1,'cv::viz::Viz3d'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#ad8f8cf39ab7d75e85686b38742b5a567',1,'cv::viz::Viz3d::Viz3d(const String &window_name=String())'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#aceda98bd840ed352c1993b6b425970da',1,'cv::viz::Viz3d::Viz3d(const Viz3d &)']]], + ['viz3d_2ehpp_483',['viz3d.hpp',['https://docs.opencv.org/4.2.0/de/d82/viz3d_8hpp.html',1,'']]], + ['vizcore_2ehpp_484',['vizcore.hpp',['https://docs.opencv.org/4.2.0/d2/d4b/vizcore_8hpp.html',1,'']]], + ['vizstorage_485',['VizStorage',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#ac45aed87eab7bc5de73cd22660f689a5',1,'cv::viz::Viz3d']]], + ['vmax2_486',['vmax2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb74fef161b3a8547118b23f603012d',1,'cv::cudev::vmax2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb74fef161b3a8547118b23f603012d',1,'vmax2()(Global Namespace)']]], + ['vmax4_487',['vmax4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac65f79fa4274b6cd38b7b5a1b12a8671',1,'cv::cudev::vmax4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac65f79fa4274b6cd38b7b5a1b12a8671',1,'vmax4()(Global Namespace)']]], + ['vmin2_488',['vmin2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3876e8efa35fa14a0cda1711ab53bd09',1,'cv::cudev::vmin2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3876e8efa35fa14a0cda1711ab53bd09',1,'vmin2()(Global Namespace)']]], + ['vmin4_489',['vmin4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafba0d98f53518d1e4b18eee07cc7f267',1,'cv::cudev::vmin4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafba0d98f53518d1e4b18eee07cc7f267',1,'vmin4()(Global Namespace)']]], + ['vocabulary_490',['vocabulary',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#ab5753a53d4f4c6e2c18b61e1b4559b98',1,'cv::BOWImgDescriptorExtractor::vocabulary'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a13e4d550f8fd132008b511ed8ec23a02',1,'cv::text::OCRBeamSearchDecoder::vocabulary'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a6e0e274c31f74ece9e5adeaf108e192b',1,'cv::text::OCRHMMDecoder::vocabulary']]], + ['void_5fpointer_491',['void_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a242e530b7ee8e5d17a017983cc7cc705',1,'__alloc_traits< _Tp_alloc_type >::void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a242e530b7ee8e5d17a017983cc7cc705',1,'__gnu_cxx::__alloc_traits::void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a242e530b7ee8e5d17a017983cc7cc705',1,'allocator_traits< _Tp_alloc_type >::void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a242e530b7ee8e5d17a017983cc7cc705',1,'std::allocator_traits::void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a2e58512fe31588cbb360b60a98190bf9',1,'std::allocator_traits< allocator< _Tp > >::void_pointer']]], + ['void_5ft_492',['void_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga22cbeb48987e9b7ee87a626eb5f1d6dc',1,'std::void_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga22cbeb48987e9b7ee87a626eb5f1d6dc',1,'void_t(Global Namespace)']]], + ['volume_493',['volume',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae048c23dc498b5012a080737e5b1d1c3',1,'Eigen::AlignedBox']]], + ['volumedims_494',['volumeDims',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a82ed5f3eee544b3ff53e4859df072e00',1,'cv::dynafu::Params::volumeDims'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#ada2bc66d79391a2ba67088ca0c75c9a6',1,'cv::kinfu::Params::volumeDims']]], + ['volumepose_495',['volumePose',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#aa80f027f90a86a3f234fb9d66f37bcc3',1,'cv::dynafu::Params::volumePose'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a3110d770b32084c3ab11f61233c23511',1,'cv::kinfu::Params::volumePose']]], + ['voronoi_5fseam_496',['VORONOI_SEAM',['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html#aa8c4c8cb01e15b4652116630d93c3eb2a55b2503305e94168c0b36c4531f288d7',1,'cv::detail::SeamFinder']]], + ['voronoiseamfinder_497',['VoronoiSeamFinder',['https://docs.opencv.org/4.2.0/db/d24/classcv_1_1detail_1_1VoronoiSeamFinder.html',1,'cv::detail']]], + ['voxelsize_498',['voxelSize',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a5b7a5f8b2669d3cbbd25912a0f2504ff',1,'cv::dynafu::Params::voxelSize'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a07d4de260fdeba606365332c782bbb0a',1,'cv::kinfu::Params::voxelSize']]], + ['vp8_499',['VP8',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146ab61d17461bd84c700fa8931e4264af88',1,'cv::cudacodec::VP8'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146ab61d17461bd84c700fa8931e4264af88',1,'VP8(Global Namespace)']]], + ['vp9_500',['VP9',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146af9085ed76f0b9089ae0039bd3edc3bf8',1,'cv::cudacodec::VP9'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146af9085ed76f0b9089ae0039bd3edc3bf8',1,'VP9(Global Namespace)']]], + ['vscale_501',['vscale',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a78522baddc2942ba4fb5281c8e7869f4',1,'cv::QtFont']]], + ['vscroll_502',['VScroll',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#ada240f2528500ad1615e76fb2fd9e2baabbfe491796298420cd5eefc79fb2ed17',1,'cv::viz::MouseEvent']]], + ['vseteq2_503',['vseteq2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01ff15b2b7c1d0685620454423dde88e',1,'cv::cudev::vseteq2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01ff15b2b7c1d0685620454423dde88e',1,'vseteq2()(Global Namespace)']]], + ['vseteq4_504',['vseteq4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36f692aef5c8080cb8960b46b14f96e3',1,'cv::cudev::vseteq4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36f692aef5c8080cb8960b46b14f96e3',1,'vseteq4()(Global Namespace)']]], + ['vsetge2_505',['vsetge2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6917a10dd7bc10547c31cfcb5e76675c',1,'cv::cudev::vsetge2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6917a10dd7bc10547c31cfcb5e76675c',1,'vsetge2()(Global Namespace)']]], + ['vsetge4_506',['vsetge4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59bddb10bcef75d257c5ebe2e7b04b7d',1,'cv::cudev::vsetge4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59bddb10bcef75d257c5ebe2e7b04b7d',1,'vsetge4()(Global Namespace)']]], + ['vsetgt2_507',['vsetgt2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f33a6b3237e708124c4564b84c6848',1,'cv::cudev::vsetgt2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f33a6b3237e708124c4564b84c6848',1,'vsetgt2()(Global Namespace)']]], + ['vsetgt4_508',['vsetgt4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga047b4a6f5b5b33d11cebe5d1a3de98d3',1,'cv::cudev::vsetgt4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga047b4a6f5b5b33d11cebe5d1a3de98d3',1,'vsetgt4()(Global Namespace)']]], + ['vsetle2_509',['vsetle2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdc0c57f0ad835fd61d7ddfe4ae33e4b',1,'cv::cudev::vsetle2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdc0c57f0ad835fd61d7ddfe4ae33e4b',1,'vsetle2()(Global Namespace)']]], + ['vsetle4_510',['vsetle4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5750754e7e85345d8efd89a35e6866d3',1,'cv::cudev::vsetle4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5750754e7e85345d8efd89a35e6866d3',1,'vsetle4()(Global Namespace)']]], + ['vsetlt2_511',['vsetlt2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf34d0415531e6b94721c4dd48b0025fe',1,'cv::cudev::vsetlt2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf34d0415531e6b94721c4dd48b0025fe',1,'vsetlt2()(Global Namespace)']]], + ['vsetlt4_512',['vsetlt4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga856c6fa9bf9db87aee51fec4a8cb9a28',1,'cv::cudev::vsetlt4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga856c6fa9bf9db87aee51fec4a8cb9a28',1,'vsetlt4()(Global Namespace)']]], + ['vsetne2_513',['vsetne2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae44f99094f082fd1151dba42df0c7fda',1,'cv::cudev::vsetne2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae44f99094f082fd1151dba42df0c7fda',1,'vsetne2()(Global Namespace)']]], + ['vsetne4_514',['vsetne4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae33c04148c2053a7a65c81a98b1f9618',1,'cv::cudev::vsetne4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae33c04148c2053a7a65c81a98b1f9618',1,'vsetne4(uint a, uint b)(Global Namespace)']]], + ['vstring_2eh_515',['vstring.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01103.html',1,'']]], + ['vstring_2etcc_516',['vstring.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01106.html',1,'']]], + ['vstring_5ffwd_2eh_517',['vstring_fwd.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01109.html',1,'']]], + ['vstring_5futil_2eh_518',['vstring_util.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01112.html',1,'']]], + ['vsub2_519',['vsub2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9984e5765f6214960ecee677531e207',1,'cv::cudev::vsub2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9984e5765f6214960ecee677531e207',1,'vsub2()(Global Namespace)']]], + ['vsub4_520',['vsub4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga678156de6871de69a5f16364b0243cfe',1,'cv::cudev::vsub4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga678156de6871de69a5f16364b0243cfe',1,'vsub4(uint a, uint b)(Global Namespace)']]], + ['vsx_20utilities_521',['VSX utilities',['https://docs.opencv.org/4.2.0/d3/d50/group__core__utils__vsx.html',1,'']]], + ['vsx_5futils_2ehpp_522',['vsx_utils.hpp',['https://docs.opencv.org/4.2.0/db/d68/vsx__utils_8hpp.html',1,'']]], + ['vt_523',['vt',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#ab1971bad7d11ee9be67e23651fc0241c',1,'cv::SVD']]], + ['vtx_524',['vtx',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aebc53cc84655eb0eb8420e26457c6b34',1,'cv::Subdiv2D']]] ]; diff --git a/search/all_20.js b/search/all_20.js index 5f8b4cc3..05921684 100644 --- a/search/all_20.js +++ b/search/all_20.js @@ -65,8 +65,8 @@ var searchData= ['wave_5fcorrect_5fvert_62',['WAVE_CORRECT_VERT',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gga83b24d4c3e93584986a56d9e43b9cf7fa3d3661394e07da0c7c51ddeb84851212',1,'cv::detail::WAVE_CORRECT_VERT'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gga83b24d4c3e93584986a56d9e43b9cf7fa3d3661394e07da0c7c51ddeb84851212',1,'WAVE_CORRECT_VERT(Global Namespace)']]], ['wavecorrect_63',['waveCorrect',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#ga8faf9588aebd5aeb6f8c649c82beb1fb',1,'cv::detail::waveCorrect()'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#ga8faf9588aebd5aeb6f8c649c82beb1fb',1,'waveCorrect()(Global Namespace)']]], ['wavecorrection_64',['waveCorrection',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#af6a51e0b23dac119a3612d57345f9a7f',1,'cv::Stitcher']]], - ['wavecorrectkind_65',['waveCorrectKind',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad9c9c9b8a97b686ad3b93f7918c4c6de',1,'cv::Stitcher']]], - ['wavecorrectkind_66',['WaveCorrectKind',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#ga83b24d4c3e93584986a56d9e43b9cf7f',1,'cv::detail::WaveCorrectKind'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#ga83b24d4c3e93584986a56d9e43b9cf7f',1,'WaveCorrectKind(Global Namespace)']]], + ['wavecorrectkind_65',['WaveCorrectKind',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#ga83b24d4c3e93584986a56d9e43b9cf7f',1,'cv::detail::WaveCorrectKind'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#ga83b24d4c3e93584986a56d9e43b9cf7f',1,'WaveCorrectKind(Global Namespace)']]], + ['wavecorrectkind_66',['waveCorrectKind',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad9c9c9b8a97b686ad3b93f7918c4c6de',1,'cv::Stitcher']]], ['wb_67',['wb',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a172ccaaba996db5201af1c17c04a5fe8abe684bb00051bf1c350a688a6f60e9c9',1,'cv']]], ['wbdetector_68',['WBDetector',['https://docs.opencv.org/4.2.0/de/d0e/classcv_1_1xobjdetect_1_1WBDetector.html',1,'cv::xobjdetect']]], ['wbuffer_5fconvert_69',['wbuffer_convert',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05907.html',1,'std::wbuffer_convert< class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05907.html#af941fb3c81aab22cf18374dc660cd838',1,'std::wbuffer_convert::wbuffer_convert()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05907.html#a9fc3680cdaa64dca1be84dfb73129928',1,'std::wbuffer_convert::wbuffer_convert(streambuf *__bytebuf, _Codecvt *__pcvt=new _Codecvt, state_type __state=state_type())']]], @@ -120,8 +120,8 @@ var searchData= ['whitepaper_117',['whitePaper',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ggaf7e286a941a896732aa34847bab9b182af9618fe50faf2a020c694c398e24e3f3',1,'cv::datasets::whitePaper'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ggaf7e286a941a896732aa34847bab9b182af9618fe50faf2a020c694c398e24e3f3',1,'whitePaper(Global Namespace)']]], ['why_20graph_20api_118',['Why Graph API?',['https://docs.opencv.org/4.2.0/d6/dc9/gapi_purposes.html',1,'']]], ['widen_119',['widen',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a48efd45b6e1d43d5120ffd37884b9f83',1,'__ctype_abstract_base< wchar_t >::widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a2dc39e55a8ed1c402dcfbd8b4cb01207',1,'__ctype_abstract_base< wchar_t >::widen(const char *__lo, const char *__hi, char_type *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'basic_ios< char, _Traits >::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'basic_iostream< char >::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'basic_istream< char >::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'basic_istream< char, _Traits >::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'basic_ostream< char >::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'basic_ostream< char, _Traits >::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a48efd45b6e1d43d5120ffd37884b9f83',1,'std::__ctype_abstract_base::widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a2dc39e55a8ed1c402dcfbd8b4cb01207',1,'std::__ctype_abstract_base::widen(const char *__lo, const char *__hi, char_type *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'std::basic_fstream::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'std::basic_ifstream::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'std::basic_ios::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'std::basic_iostream::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'std::basic_istream::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'std::basic_istringstream::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'std::basic_ofstream::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'std::basic_ostream::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'std::basic_ostringstream::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b4b27c391cfd8af35923ef8e6b918d1',1,'std::basic_stringstream::widen()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a48efd45b6e1d43d5120ffd37884b9f83',1,'std::ctype::widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a2dc39e55a8ed1c402dcfbd8b4cb01207',1,'std::ctype::widen(const char *__lo, const char *__hi, char_type *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#adb03af528f35f54abb0e5145e82d6f98',1,'std::ctype< char >::widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a536369ec0cf9590af6c627ff27a407bc',1,'std::ctype< char >::widen(const char *__lo, const char *__hi, char_type *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a48efd45b6e1d43d5120ffd37884b9f83',1,'std::ctype< wchar_t >::widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a2dc39e55a8ed1c402dcfbd8b4cb01207',1,'std::ctype< wchar_t >::widen(const char *__lo, const char *__hi, char_type *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a48efd45b6e1d43d5120ffd37884b9f83',1,'std::ctype_byname::widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a2dc39e55a8ed1c402dcfbd8b4cb01207',1,'std::ctype_byname::widen(const char *__lo, const char *__hi, char_type *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#adb03af528f35f54abb0e5145e82d6f98',1,'std::ctype_byname< char >::widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a536369ec0cf9590af6c627ff27a407bc',1,'std::ctype_byname< char >::widen(const char *__lo, const char *__hi, char_type *__to) const']]], - ['widget_120',['Pose of a widget',['https://docs.opencv.org/4.2.0/d8/df0/tutorial_widget_pose.html',1,'']]], - ['widget_121',['Widget',['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html',1,'cv::viz::Widget'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#a4ff9121e7753257a51f3ad4b21c63b7e',1,'cv::viz::Widget::Widget()'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#a8bc886a326082d0bc9b5e5754a73bff6',1,'cv::viz::Widget::Widget(const Widget &other)'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html',1,'Widget']]], + ['widget_120',['Widget',['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html',1,'cv::viz::Widget'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#a4ff9121e7753257a51f3ad4b21c63b7e',1,'cv::viz::Widget::Widget()'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#a8bc886a326082d0bc9b5e5754a73bff6',1,'cv::viz::Widget::Widget(const Widget &other)'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html',1,'Widget']]], + ['widget_121',['Pose of a widget',['https://docs.opencv.org/4.2.0/d8/df0/tutorial_widget_pose.html',1,'']]], ['widget2d_122',['Widget2D',['https://docs.opencv.org/4.2.0/d3/d49/classcv_1_1viz_1_1Widget2D.html',1,'cv::viz::Widget2D'],['https://docs.opencv.org/4.2.0/d3/d49/classcv_1_1viz_1_1Widget2D.html#afa60b0b8fa7a9ba2e790149affe60fa4',1,'cv::viz::Widget2D::Widget2D()']]], ['widget3d_123',['Widget3D',['https://docs.opencv.org/4.2.0/d9/d26/classcv_1_1viz_1_1Widget3D.html',1,'cv::viz::Widget3D'],['https://docs.opencv.org/4.2.0/d9/d26/classcv_1_1viz_1_1Widget3D.html#a26f4ab309c70236b4a6b32ea3534207f',1,'cv::viz::Widget3D::Widget3D()']]], ['widget_5faccessor_2ehpp_124',['widget_accessor.hpp',['https://docs.opencv.org/4.2.0/d7/d5d/widget__accessor_8hpp.html',1,'']]], @@ -195,138 +195,137 @@ var searchData= ['with_20gdal_192',['Reading Geospatial Raster files with GDAL',['https://docs.opencv.org/4.2.0/d7/d73/tutorial_raster_io_gdal.html',1,'']]], ['with_20images_193',['with Images',['https://docs.opencv.org/4.2.0/dc/d2e/tutorial_py_image_display.html',1,'Getting Started with Images'],['https://docs.opencv.org/4.2.0/df/d24/tutorial_js_image_display.html',1,'Getting Started with Images']]], ['with_20images_194',['Operations with images',['https://docs.opencv.org/4.2.0/d5/d98/tutorial_mat_operations.html',1,'']]], - ['with_20opencv_195',['Android Development with OpenCV',['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'']]], - ['with_20opencv_196',['Camera calibration With OpenCV',['https://docs.opencv.org/4.2.0/d4/d94/tutorial_camera_calibration.html',1,'']]], - ['with_20opencv_197',['with OpenCV',['https://docs.opencv.org/4.2.0/d7/d9e/tutorial_video_write.html',1,'Creating a video with OpenCV'],['https://docs.opencv.org/4.2.0/da/d60/tutorial_face_main.html',1,'Face Recognition with OpenCV'],['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'How to scan images, lookup tables and time measurement with OpenCV'],['https://docs.opencv.org/4.2.0/df/d61/tutorial_random_generator_and_text.html',1,'Random generator and text with OpenCV']]], - ['with_20opencv_20and_20similarity_20measurement_198',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], - ['with_20opencv_20inside_20the_20microsoft_20visual_20studio_199',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['with_20opencv_20overview_200',['Video I/O with OpenCV Overview',['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'']]], - ['with_20raw_20buffers_3a_20the_20map_20class_201',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], - ['with_20square_20chessboard_202',['Camera calibration with square chessboard',['https://docs.opencv.org/4.2.0/dc/d43/tutorial_camera_calibration_square_chess.html',1,'']]], - ['with_20thrust_203',['Using a cv::cuda::GpuMat with thrust',['https://docs.opencv.org/4.2.0/d8/db9/tutorial_gpu_thrust_interop.html',1,'']]], - ['with_20tt_20clang_20format_20tt_204',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], - ['with_20videos_205',['with Videos',['https://docs.opencv.org/4.2.0/dd/d43/tutorial_py_video_display.html',1,'Getting Started with Videos'],['https://docs.opencv.org/4.2.0/dd/d00/tutorial_js_video_display.html',1,'Getting Started with Videos']]], - ['with_20watershed_20algorithm_206',['with Watershed Algorithm',['https://docs.opencv.org/4.2.0/d3/db4/tutorial_py_watershed.html',1,'Image Segmentation with Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d7/d1c/tutorial_js_watershed.html',1,'Image Segmentation with Watershed Algorithm']]], - ['withdepth_207',['withDepth',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a82c512d99a4ed51a3372b78a9ddc8dce',1,'cv::GMatDesc']]], - ['withformat_208',['WithFormat',['https://eigen.tuxfamily.org/dox/classEigen_1_1WithFormat.html',1,'Eigen']]], - ['withoutmask_209',['WithOutMask',['https://docs.opencv.org/4.2.0/da/d2c/structcv_1_1cudev_1_1WithOutMask.html',1,'cv::cudev']]], - ['withsize_210',['withSize',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#aa0a8e3b6f80aede6415e0ea5b0dc3515',1,'cv::GMatDesc::withSize(cv::Size sz) const'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a84cf854c735e32aee07fb4ad5b56ea80',1,'cv::GMatDesc::withSize(cv::gapi::own::Size sz) const']]], - ['withsizedelta_211',['withSizeDelta',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#af77162706a109db4e2f72cc5f1696ad7',1,'cv::GMatDesc::withSizeDelta(cv::gapi::own::Size delta) const'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a9210d5700cc720d70bf3df2e2374ee02',1,'cv::GMatDesc::withSizeDelta(cv::Size delta) const'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#ac3da6d65d65160b358670d6566747f35',1,'cv::GMatDesc::withSizeDelta(int dx, int dy) const']]], - ['withtype_212',['withType',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a2a7556619457489e32202631f0e0414e',1,'cv::GMatDesc']]], - ['wline_213',['WLine',['https://docs.opencv.org/4.2.0/d6/d8e/classcv_1_1viz_1_1WLine.html',1,'cv::viz::WLine'],['https://docs.opencv.org/4.2.0/d6/d8e/classcv_1_1viz_1_1WLine.html#ac2215e5beee395b25ca5f1e0c20aebc7',1,'cv::viz::WLine::WLine()']]], - ['wmesh_214',['WMesh',['https://docs.opencv.org/4.2.0/d2/d76/classcv_1_1viz_1_1WMesh.html',1,'cv::viz::WMesh'],['https://docs.opencv.org/4.2.0/d2/d76/classcv_1_1viz_1_1WMesh.html#a14289d8a4b99950edf0c1fb855730ae4',1,'cv::viz::WMesh::WMesh(const Mesh &mesh)'],['https://docs.opencv.org/4.2.0/d2/d76/classcv_1_1viz_1_1WMesh.html#a5023e5228d28ea876415140312b24415',1,'cv::viz::WMesh::WMesh(InputArray cloud, InputArray polygons, InputArray colors=noArray(), InputArray normals=noArray())']]], - ['wmf_5fcos_215',['WMF_COS',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6a0cd93f618be5627d6998ea43a7532a69',1,'cv::ximgproc']]], - ['wmf_5fexp_216',['WMF_EXP',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6a7bb4cc9c7bc728a9e29b4503952e47a2',1,'cv::ximgproc']]], - ['wmf_5fiv1_217',['WMF_IV1',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6ab180d3fd333a0829c17db4036f010036',1,'cv::ximgproc']]], - ['wmf_5fiv2_218',['WMF_IV2',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6af5f9edde9a1f3b6ca9b7fe81b28b2cb9',1,'cv::ximgproc']]], - ['wmf_5fjac_219',['WMF_JAC',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6ac59ff751a6f0f28092383279e0631e75',1,'cv::ximgproc']]], - ['wmf_5foff_220',['WMF_OFF',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6a623aacf6d30cafdadc49b52749a3a1f6',1,'cv::ximgproc']]], - ['wmfweighttype_221',['WMFWeightType',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6',1,'cv::ximgproc']]], - ['wnd_5fprop_5faspect_5fratio_222',['WND_PROP_ASPECT_RATIO',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a635a6ff3b81e4019be4a43b64e7b2bbb',1,'cv::WND_PROP_ASPECT_RATIO'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a635a6ff3b81e4019be4a43b64e7b2bbb',1,'WND_PROP_ASPECT_RATIO(Global Namespace)']]], - ['wnd_5fprop_5fautosize_223',['WND_PROP_AUTOSIZE',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a40b8385d11a44871776eed13da7808a2',1,'cv::WND_PROP_AUTOSIZE'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a40b8385d11a44871776eed13da7808a2',1,'WND_PROP_AUTOSIZE(Global Namespace)']]], - ['wnd_5fprop_5ffullscreen_224',['WND_PROP_FULLSCREEN',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a3b6a89b0daf2149dab93f9c6ab99fcc8',1,'cv::WND_PROP_FULLSCREEN'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a3b6a89b0daf2149dab93f9c6ab99fcc8',1,'WND_PROP_FULLSCREEN(Global Namespace)']]], - ['wnd_5fprop_5fopengl_225',['WND_PROP_OPENGL',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a360f30201f153e192919289d7c002e04',1,'cv::WND_PROP_OPENGL'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a360f30201f153e192919289d7c002e04',1,'WND_PROP_OPENGL(Global Namespace)']]], - ['wnd_5fprop_5ftopmost_226',['WND_PROP_TOPMOST',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a2a1ae9effa9adebfde8c7d853f0182c0',1,'cv::WND_PROP_TOPMOST'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a2a1ae9effa9adebfde8c7d853f0182c0',1,'WND_PROP_TOPMOST(Global Namespace)']]], - ['wnd_5fprop_5fvisible_227',['WND_PROP_VISIBLE',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a07598b61a8b3047cb93634130beddf81',1,'cv::WND_PROP_VISIBLE'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a07598b61a8b3047cb93634130beddf81',1,'WND_PROP_VISIBLE(Global Namespace)']]], - ['wobble_5fsuppression_2ehpp_228',['wobble_suppression.hpp',['https://docs.opencv.org/4.2.0/d0/df9/wobble__suppression_8hpp.html',1,'']]], - ['wobblesuppressor_229',['wobbleSuppressor',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a764d3f09e4906ef6e5ec7f1a3686fea1',1,'cv::videostab::TwoPassStabilizer']]], - ['wobblesuppressor_5f_230',['wobbleSuppressor_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a846fdfe7df7f6e9734ae98f033f2b8b0',1,'cv::videostab::TwoPassStabilizer']]], - ['wobblesuppressorbase_231',['WobbleSuppressorBase',['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html',1,'cv::videostab::WobbleSuppressorBase'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a5067ab72f26aec1b3dbe346569a2a08b',1,'cv::videostab::WobbleSuppressorBase::WobbleSuppressorBase()']]], - ['wofstream_232',['wofstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gab5d4d2c5ad9ee70018becc9002629a71',1,'std::wofstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gab5d4d2c5ad9ee70018becc9002629a71',1,'wofstream(Global Namespace)']]], - ['woodenboard_233',['woodenBoard',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ggaf7e286a941a896732aa34847bab9b182adb140e2810e33fb6d03e068628421923',1,'cv::datasets::woodenBoard'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ggaf7e286a941a896732aa34847bab9b182adb140e2810e33fb6d03e068628421923',1,'woodenBoard(Global Namespace)']]], - ['word_234',['word',['https://docs.opencv.org/4.2.0/d7/d98/structcv_1_1datasets_1_1word.html',1,'cv::datasets']]], - ['words_235',['words',['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1datasets_1_1TR__icdarObj.html#a282faa1ce4484e4eda98969d124cd2c2',1,'cv::datasets::TR_icdarObj']]], - ['work_5ftype_236',['work_type',['https://docs.opencv.org/4.2.0/da/dad/structcv_1_1cudev_1_1Avg.html#aaf77aea7cf2f2b0b9ac0095468bb58cf',1,'cv::cudev::Avg::work_type'],['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1cudev_1_1Max.html#ab99c93dcaad74858a575e0e376677819',1,'cv::cudev::Max::work_type'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1Min.html#a918e142b2d587b51557d77ead9093bd1',1,'cv::cudev::Min::work_type'],['https://docs.opencv.org/4.2.0/d8/d60/structcv_1_1cudev_1_1Sum.html#aa63302b148d3b07fb231f47872f535db',1,'cv::cudev::Sum::work_type']]], - ['workcycleobjectdetectorfunction_237',['workcycleObjectDetectorFunction',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#acbbf5473e3e123f3a376397d703a67af',1,'cv::DetectionBasedTracker']]], - ['workgroupsize_238',['workGroupSize',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#ad4d8b8b503683b9ab5764e4faa54984a',1,'cv::ocl::Kernel']]], - ['working_20with_20different_20datasets_239',['Framework for working with different datasets',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html',1,'']]], - ['works_240',['How OpenCV-Python Bindings Works?',['https://docs.opencv.org/4.2.0/da/d49/tutorial_py_bindings_basics.html',1,'']]], - ['workscale_241',['workScale',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a69f0feb213330d7e4806892867ac4249',1,'cv::Stitcher']]], - ['workstealing_2eh_242',['workstealing.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00983.html',1,'']]], - ['world_20vision_243',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], - ['world_5finterface_244',['WORLD_INTERFACE',['../namespacerobot.html#ad2a31e2720609dd7619fc2bbafcf441e',1,'robot']]], - ['world_5finterface_5finit_245',['world_interface_init',['../namespacerobot.html#a65584ffb83e20412a795461b921deb5f',1,'robot']]], - ['worldinterface_246',['WorldInterface',['../namespacerobot.html#a81cb1706e1f0e7c0639e231446ce4c9e',1,'robot']]], - ['wostream_247',['wostream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga9ad6702c06821cdd550e08ef2b70f3b7',1,'std::wostream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga9ad6702c06821cdd550e08ef2b70f3b7',1,'wostream(Global Namespace)']]], - ['wostringstream_248',['wostringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga811d6452576dc4c2fccd0ab26fd23f07',1,'std::wostringstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga811d6452576dc4c2fccd0ab26fd23f07',1,'wostringstream(Global Namespace)']]], - ['wpaintedcloud_249',['WPaintedCloud',['https://docs.opencv.org/4.2.0/db/de8/classcv_1_1viz_1_1WPaintedCloud.html',1,'cv::viz::WPaintedCloud'],['https://docs.opencv.org/4.2.0/db/de8/classcv_1_1viz_1_1WPaintedCloud.html#a2e0baaa4cade67743997d621663d03fa',1,'cv::viz::WPaintedCloud::WPaintedCloud(InputArray cloud)'],['https://docs.opencv.org/4.2.0/db/de8/classcv_1_1viz_1_1WPaintedCloud.html#ab68a1a7049074405bd4f3f6f515b44f5',1,'cv::viz::WPaintedCloud::WPaintedCloud(InputArray cloud, const Point3d &p1, const Point3d &p2)'],['https://docs.opencv.org/4.2.0/db/de8/classcv_1_1viz_1_1WPaintedCloud.html#af11520c9484ab6bef4bbaa865bc06da3',1,'cv::viz::WPaintedCloud::WPaintedCloud(InputArray cloud, const Point3d &p1, const Point3d &p2, const Color &c1, const Color c2)']]], - ['wplane_250',['WPlane',['https://docs.opencv.org/4.2.0/d8/d01/classcv_1_1viz_1_1WPlane.html',1,'cv::viz::WPlane'],['https://docs.opencv.org/4.2.0/d8/d01/classcv_1_1viz_1_1WPlane.html#a7e90024f2cd4702ae8a866eae190b244',1,'cv::viz::WPlane::WPlane(const Size2d &size=Size2d(1.0, 1.0), const Color &color=Color::white())'],['https://docs.opencv.org/4.2.0/d8/d01/classcv_1_1viz_1_1WPlane.html#ad2f8a3587414f568db549a3a44a85831',1,'cv::viz::WPlane::WPlane(const Point3d &center, const Vec3d &normal, const Vec3d &new_yaxis, const Size2d &size=Size2d(1.0, 1.0), const Color &color=Color::white())']]], - ['wpolyline_251',['WPolyLine',['https://docs.opencv.org/4.2.0/de/ddb/classcv_1_1viz_1_1WPolyLine.html',1,'cv::viz::WPolyLine'],['https://docs.opencv.org/4.2.0/de/ddb/classcv_1_1viz_1_1WPolyLine.html#a456e068ad7263ee03df21b309dd5d9a2',1,'cv::viz::WPolyLine::WPolyLine(InputArray points, InputArray colors)'],['https://docs.opencv.org/4.2.0/de/ddb/classcv_1_1viz_1_1WPolyLine.html#af72ef02dec6f4a8d573890b8604ca09d',1,'cv::viz::WPolyLine::WPolyLine(InputArray points, const Color &color=Color::white())']]], - ['wrap_252',['wrap',['https://docs.opencv.org/4.2.0/d9/d7d/structcv_1_1detail_1_1WrapValue.html#ad04caed470836f37d609b4778558d0a7',1,'cv::detail::WrapValue']]], - ['wrap_5fgapi_5fhelper_253',['wrap_gapi_helper',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a36b52c324bc6d7c82b480deeeb6766ae',1,'cv::detail']]], - ['wrap_5fhost_5fhelper_254',['wrap_host_helper',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#af4fa8b5545a2e8a78239f1b452706ecf',1,'cv::detail']]], - ['wrap_5fin_255',['wrap_in',['https://docs.opencv.org/4.2.0/da/d1b/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GArray_3_01T_01_4_01_4.html#a5a541dfa504b30b5407d2db322b5ac36',1,'cv::detail::GTypeTraits< cv::GArray< T > >::wrap_in()'],['https://docs.opencv.org/4.2.0/d9/d7d/structcv_1_1detail_1_1WrapValue.html#aaa1c2a817c4b76bb3a373055e5e913c1',1,'cv::detail::WrapValue::wrap_in()']]], - ['wrap_5fkernel_256',['wrap_kernel',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a2927f9b915e5d02ff0e943ddc0efbeca',1,'cv::TrackerKCF::Params']]], - ['wrap_5fout_257',['wrap_out',['https://docs.opencv.org/4.2.0/da/d1b/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GArray_3_01T_01_4_01_4.html#a998319a3020e3deb96b1b838fb12d519',1,'cv::detail::GTypeTraits< cv::GArray< T > >::wrap_out()'],['https://docs.opencv.org/4.2.0/d9/d7d/structcv_1_1detail_1_1WrapValue.html#a1623c10984c912c223c7074572074cfe',1,'cv::detail::WrapValue::wrap_out()']]], - ['wrap_5fvalue_258',['wrap_value',['https://docs.opencv.org/4.2.0/da/d1b/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GArray_3_01T_01_4_01_4.html#a9d31069a644ac8142a480db3fefa42ee',1,'cv::detail::GTypeTraits< cv::GArray< T > >']]], - ['wrapevent_259',['wrapEvent',['https://docs.opencv.org/4.2.0/da/d71/structcv_1_1cuda_1_1EventAccessor.html#a20adf37615b96e3b5b59b2f6eb931cce',1,'cv::cuda::EventAccessor']]], - ['wrapper_260',['Const-propagating wrapper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01526.html',1,'']]], - ['wrapperemd_261',['wrapperEMD',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga31fdda0864e64ca6b9de252a2611758b',1,'cv::wrapperEMD()'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga31fdda0864e64ca6b9de252a2611758b',1,'wrapperEMD()(Global Namespace)']]], - ['wrapstream_262',['wrapStream',['https://docs.opencv.org/4.2.0/d6/df1/structcv_1_1cuda_1_1StreamAccessor.html#a4fa7571e434f78b461efcd0e52dc8132',1,'cv::cuda::StreamAccessor']]], - ['wrapvalue_263',['WrapValue',['https://docs.opencv.org/4.2.0/d9/d7d/structcv_1_1detail_1_1WrapValue.html',1,'cv::detail']]], - ['wref_264',['wref',['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html#a81a3ac44db5256abb0fe57ececda2383',1,'cv::detail::VectorRef::wref()'],['https://docs.opencv.org/4.2.0/d2/dab/classcv_1_1detail_1_1VectorRefT.html#a912902c204688d90ef0f742009158ef6',1,'cv::detail::VectorRefT::wref()']]], - ['wregex_265',['wregex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae16f87e70ea5847b0399a396c637615f',1,'std::wregex'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae16f87e70ea5847b0399a396c637615f',1,'wregex(Global Namespace)']]], - ['write_266',['WRITE',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da747a241cefee7b8af34c3d804c864ad6',1,'cv::FileStorage']]], - ['write_267',['write',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a1f8ad7b8add515077367fb9949a174d2',1,'cv::Algorithm::write(FileStorage &fs) const'],['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a763a62d1b03042eef7d7fc3ac6c87c79',1,'cv::Algorithm::write(const Ptr< FileStorage > &fs, const String &name=String()) const'],['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html#a7f0e55c29e3c982f389cf601141359ac',1,'cv::face::BasicFaceRecognizer::write()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a7e39bfe7462f22ba08b11474827c68eb',1,'cv::line_descriptor::BinaryDescriptor::write()'],['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a5fb3cc4af2c17519e9901c9f5fa29047',1,'cv::linemod::ColorGradient::write()'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#a7fc483d903a6cf340b5446c092c86ea7',1,'cv::CvFeatureParams::write()'],['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#ad4bee2484c21cc717e01efd01d7afb88',1,'cv::CvHaarFeatureParams::write()'],['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html#a7020bf3bafcb950c8244c08eb38cf117',1,'cv::CvParams::write()'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a0f08a979b7d0d2fda254c2b450379477',1,'cv::linemod::DepthNormal::write()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a9e848d967aaed6930da407f338ca17ba',1,'cv::DescriptorMatcher::write(const String &fileName) const'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#abcba89024601e88afe6e4cc2349798c3',1,'cv::DescriptorMatcher::write(FileStorage &) const CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#ad516a0d4afa280c256123e082a1e02c1',1,'cv::DescriptorMatcher::write(const Ptr< FileStorage > &fs, const String &name=String()) const'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a45ad63d73e6ff0967b1f479912801a95',1,'cv::linemod::Detector::write()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#a2adf2d555550194244b05c91fefcb4d6',1,'cv::face::FaceRecognizer::write(const String &filename) const'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#a4756dbf9b97408ba5f3677296c3a1695',1,'cv::face::FaceRecognizer::write(FileStorage &fs) const CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d9/db9/structcv_1_1linemod_1_1Feature.html#a1e2bfa2a6eb9d9c79c603cccb92809b8',1,'cv::linemod::Feature::write()'],['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#ad941791a15015544f77b04b0d4b19f95',1,'cv::CvHOGEvaluator::Feature::write(FileStorage &fs) const'],['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#ae27012db6a9f5da0a03ebee7defc49fa',1,'cv::CvHOGEvaluator::Feature::write(FileStorage &fs, int varIdx) const'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html#acb9f30b27f452cd7248357b590055d02',1,'cv::CvLBPEvaluator::Feature::write()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a856b4bc1303a7ee8fcec452c7c62f969',1,'cv::Feature2D::write(const String &fileName) const'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a45193ec538b7178e5ce6f38394ca131a',1,'cv::Feature2D::write(FileStorage &) const CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a9805c698c6ec2ef90bd6b40efddcc257',1,'cv::Feature2D::write(const Ptr< FileStorage > &fs, const String &name=String()) const'],['https://docs.opencv.org/4.2.0/d3/d52/classcv_1_1CvHaarEvaluator_1_1FeatureHaar.html#aa5457df5ecb3d1037a44841002bb4144',1,'cv::CvHaarEvaluator::FeatureHaar::write()'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a3efd38c576bac8b66281826f0a2642e7',1,'cv::FileStorage::write(const String &name, int val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af9597d58d64dff5cc998344bc4b1c1f0',1,'cv::FileStorage::write(const String &name, double val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a0466680193c966dbeef4e508aebfe8aa',1,'cv::FileStorage::write(const String &name, const String &val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a5335e0f3caa5d44d79edcafcbc0091d8',1,'cv::FileStorage::write(const String &name, const Mat &val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9d9ee20427f73c94ee89ce893831614a',1,'cv::FileStorage::write(const String &name, const std::vector< String > &val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a26447446dd3fa0644684a045e16399fe',1,'cv::FileStorage::write(FileStorage &fs, const String &name, int value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aebc12a5356bcba8393d9f1fbf901065b',1,'cv::FileStorage::write(FileStorage &fs, const String &name, float value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a598e853f2001864e2c709d7726ad29b7',1,'cv::FileStorage::write(FileStorage &fs, const String &name, double value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a63a75e0be408d41f9dea527a1c960286',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const String &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a403766cfd06a4c7fc56f3a6187fabc35',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Mat &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9d8021889a9984dee8c7913fde569cff',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const SparseMat &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a24430b807ccd2cf002058961cd2e3263',1,'cv::FileStorage::write(FileStorage &fs, const _Tp &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9588e05768869430821699ae6b1eb28d',1,'cv::FileStorage::write(FileStorage &fs, const int &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ac229241c6dd16bb343de5aeee197db03',1,'cv::FileStorage::write(FileStorage &fs, const float &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa0e3cc864beb06182c8c2826a8d0cdb8',1,'cv::FileStorage::write(FileStorage &fs, const double &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a058d1227fa81fbf9ffc926d1a2485f3d',1,'cv::FileStorage::write(FileStorage &fs, const String &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa627e4c875c46d7830fb6d0ac1431e00',1,'cv::FileStorage::write(FileStorage &fs, const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ad2ecdf5485d88536eb7c97662a428a4e',1,'cv::FileStorage::write(FileStorage &fs, const Point3_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9700290bb5ec6b5c890bc0d251855f61',1,'cv::FileStorage::write(FileStorage &fs, const Size_< _Tp > &sz)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a843319acfe360410e8cfcff1749aa5b0',1,'cv::FileStorage::write(FileStorage &fs, const Complex< _Tp > &c)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#abff24d9b3462a4d368e864b09c62de46',1,'cv::FileStorage::write(FileStorage &fs, const Rect_< _Tp > &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a5d8a4afcb9a84c5705605b6456f0bf4a',1,'cv::FileStorage::write(FileStorage &fs, const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#afcf3219ea83b2e466f0d9631ea53d7a3',1,'cv::FileStorage::write(FileStorage &fs, const Matx< _Tp, m, n > &x)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a54bf874d535dfc61b08fff99e7b5e8ab',1,'cv::FileStorage::write(FileStorage &fs, const Scalar_< _Tp > &s)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#acb53272996fd5a25ca077aeb5385a9a3',1,'cv::FileStorage::write(FileStorage &fs, const Range &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af710db7aa40918f5429ba8e78622d08f',1,'cv::FileStorage::write(FileStorage &fs, const std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a04c8f9337b9d9821114f951faee80bae',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a550f8a4931274589cdc5a3796c2eef48',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Point3_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a84453625335849d8ec1a0df6c865b0cb',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Size_< _Tp > &sz)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ace7fc76da8b2a634a5c83183700f0bbb',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Complex< _Tp > &c)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a43c8a8a86952cff8b062e18c9f3e72cc',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Rect_< _Tp > &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a893a9ed023837feb61f7fe804d21cb40',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae11814668aa0bf1957b8c612eaac033d',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Matx< _Tp, m, n > &x)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a6f13874950203b1bbbe4ec4fee5eb6a1',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Scalar_< _Tp > &s)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#addda29520f80f53e144a5e15b57ec98d',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Range &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a1fcc9cf302523a5ab15f62f77a3bd6dd',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const KeyPoint &kpt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa7eda7701e29ddfcba1ce21615113c67',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const DMatch &m)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ac1f774dd8fb03a6b5207e022d3553f2d',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const _Tp &val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a6e3ddba0ac9a82d6f7817f9db1aa2556',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af9feef3fb24eb47d9a665056977d1183',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const std::vector< std::vector< _Tp > > &vec)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a26447446dd3fa0644684a045e16399fe',1,'cv::FileStorage::write(FileStorage &fs, const String &name, int value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aebc12a5356bcba8393d9f1fbf901065b',1,'cv::FileStorage::write(FileStorage &fs, const String &name, float value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a598e853f2001864e2c709d7726ad29b7',1,'cv::FileStorage::write(FileStorage &fs, const String &name, double value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a63a75e0be408d41f9dea527a1c960286',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const String &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a403766cfd06a4c7fc56f3a6187fabc35',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Mat &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9d8021889a9984dee8c7913fde569cff',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const SparseMat &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a24430b807ccd2cf002058961cd2e3263',1,'cv::FileStorage::write(FileStorage &fs, const _Tp &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9588e05768869430821699ae6b1eb28d',1,'cv::FileStorage::write(FileStorage &fs, const int &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ac229241c6dd16bb343de5aeee197db03',1,'cv::FileStorage::write(FileStorage &fs, const float &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa0e3cc864beb06182c8c2826a8d0cdb8',1,'cv::FileStorage::write(FileStorage &fs, const double &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a058d1227fa81fbf9ffc926d1a2485f3d',1,'cv::FileStorage::write(FileStorage &fs, const String &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa627e4c875c46d7830fb6d0ac1431e00',1,'cv::FileStorage::write(FileStorage &fs, const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ad2ecdf5485d88536eb7c97662a428a4e',1,'cv::FileStorage::write(FileStorage &fs, const Point3_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9700290bb5ec6b5c890bc0d251855f61',1,'cv::FileStorage::write(FileStorage &fs, const Size_< _Tp > &sz)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a843319acfe360410e8cfcff1749aa5b0',1,'cv::FileStorage::write(FileStorage &fs, const Complex< _Tp > &c)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#abff24d9b3462a4d368e864b09c62de46',1,'cv::FileStorage::write(FileStorage &fs, const Rect_< _Tp > &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a5d8a4afcb9a84c5705605b6456f0bf4a',1,'cv::FileStorage::write(FileStorage &fs, const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#afcf3219ea83b2e466f0d9631ea53d7a3',1,'cv::FileStorage::write(FileStorage &fs, const Matx< _Tp, m, n > &x)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a54bf874d535dfc61b08fff99e7b5e8ab',1,'cv::FileStorage::write(FileStorage &fs, const Scalar_< _Tp > &s)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#acb53272996fd5a25ca077aeb5385a9a3',1,'cv::FileStorage::write(FileStorage &fs, const Range &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af710db7aa40918f5429ba8e78622d08f',1,'cv::FileStorage::write(FileStorage &fs, const std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a04c8f9337b9d9821114f951faee80bae',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a550f8a4931274589cdc5a3796c2eef48',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Point3_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a84453625335849d8ec1a0df6c865b0cb',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Size_< _Tp > &sz)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ace7fc76da8b2a634a5c83183700f0bbb',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Complex< _Tp > &c)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a43c8a8a86952cff8b062e18c9f3e72cc',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Rect_< _Tp > &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a893a9ed023837feb61f7fe804d21cb40',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae11814668aa0bf1957b8c612eaac033d',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Matx< _Tp, m, n > &x)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a6f13874950203b1bbbe4ec4fee5eb6a1',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Scalar_< _Tp > &s)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#addda29520f80f53e144a5e15b57ec98d',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Range &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a1fcc9cf302523a5ab15f62f77a3bd6dd',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const KeyPoint &kpt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa7eda7701e29ddfcba1ce21615113c67',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const DMatch &m)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ac1f774dd8fb03a6b5207e022d3553f2d',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const _Tp &val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a6e3ddba0ac9a82d6f7817f9db1aa2556',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af9feef3fb24eb47d9a665056977d1183',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const std::vector< std::vector< _Tp > > &vec)'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#af612c5c0956c84b96886214850d3a0bc',1,'cv::FlannBasedMatcher::write()'],['https://docs.opencv.org/4.2.0/da/dfe/classcv_1_1optflow_1_1GPCForest.html#a317f6d1fd8a028e47c469eb1778af9db',1,'cv::optflow::GPCForest::write()'],['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#a396150fc270fc42152219b39105f29c4',1,'cv::optflow::GPCTree::write()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a2c13c67988147921d6ba313e15de5fda',1,'cv::HOGDescriptor::write()'],['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html#ac8ec5fe840feca057df5a4f90c7bd7b4',1,'cv::linemod::Modality::write()'],['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#ad70dd357d8e4386f8c147897f966b40e',1,'cv::saliency::ObjectnessBING::write()'],['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html#afa2950e99d03759f3e2394f7a5672a98',1,'cv::TrackerMIL::Params::write()'],['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#a06f76caf3e89aaddfc540e0a6bdd9ae3',1,'cv::TrackerBoosting::Params::write()'],['https://docs.opencv.org/4.2.0/d3/dd0/structcv_1_1TrackerTLD_1_1Params.html#a485ac93be2b220d8b020dcc8d9e5e0b4',1,'cv::TrackerTLD::Params::write()'],['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a56d11b10af7e63e34c8ccff1bce443a1',1,'cv::TrackerKCF::Params::write()'],['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1TrackerGOTURN_1_1Params.html#acc89c25f05279f72695bca8bdbc1c125',1,'cv::TrackerGOTURN::Params::write()'],['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#af40d2712494f15b6b884c0c170a3dd95',1,'cv::TrackerCSRT::Params::write()'],['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#a6eb4f9a24ac568f6eb62ef17885c4490',1,'cv::TrackerMedianFlow::Params::write()'],['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#ab2873083a7433d4234500fa03674f902',1,'cv::face::FacemarkAAM::Params::write()'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#ac150e2bd3daab2c329a21d1b522b12c4',1,'cv::face::FacemarkLBF::Params::write()'],['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a0f5a3d9c595f1ebf20786fad3139a4df',1,'cv::SimpleBlobDetector::Params::write()'],['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#aaf5563228474e836b7704faa0946e30b',1,'cv::line_descriptor::BinaryDescriptor::Params::write()'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a8be99fa476731ff5429c241e9a92a57b',1,'cv::PCA::write()'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a6ca674fac252493b7f7c482fe9459d28',1,'cv::ppf_match_3d::PPF3DDetector::write()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a227be08609d12665e3677ec40f898b3a',1,'cv::ocl::Program::write()'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a92d80a2c309c46a46b22ec125cad3943',1,'cv::bioinspired::Retina::write(String fs) const=0'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#af0fb1fda44face9993785ef41b38430d',1,'cv::bioinspired::Retina::write(FileStorage &fs) const CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#a798e24c07c8632fa44c46cb00ac4bb43',1,'cv::saliency::StaticSaliencySpectralResidual::write()'],['https://docs.opencv.org/4.2.0/d2/dc7/structcv_1_1linemod_1_1Template.html#ac967858e0c0672241202f255ac6dba13',1,'cv::linemod::Template::write()'],['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a2c96f70b2791b5a9684c33382095f3dc',1,'cv::Tracker::write()'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#a15675b516e84363d664ee28fd88ace3a',1,'cv::bioinspired::TransientAreasSegmentationModule::write(String fs) const=0'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#a201d5ffa41f8eee4e98e179fa036a07a',1,'cv::bioinspired::TransientAreasSegmentationModule::write(cv::FileStorage &fs) const CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/df/dde/classcv_1_1cudacodec_1_1VideoWriter.html#a6318b8266c824bd17081940a7930b18e',1,'cv::cudacodec::VideoWriter::write()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a30ebbc09c122332f62bd706b43f02a98',1,'cv::VideoWriter::write()'],['https://docs.opencv.org/4.2.0/de/d0e/classcv_1_1xobjdetect_1_1WBDetector.html#a7d85338895707904ae1ddb4374ec8dac',1,'cv::xobjdetect::WBDetector::write()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'basic_iostream< char >::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'basic_iostream< char >::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'basic_ostream< char >::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'basic_ostream< char >::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'basic_ostream< char, _Traits >::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'basic_ostream< char, _Traits >::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_fstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_fstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_iostream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_iostream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_ofstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_ofstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_ostream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_ostream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_ostringstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_ostringstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_stringstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_stringstream::write(const char_type *__s, streamsize __n)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a027b764f14e54f8838b5120e991bd29c',1,'cv::write()'],['../group__camera.html#ga806482a95ece6e635dc2adea22008df5',1,'cam::write()']]], - ['write_5fbase64_268',['WRITE_BASE64',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da74cdcbdb96c29f19e3ccc2ba4ab81614',1,'cv::FileStorage']]], - ['write_5fcombined_269',['WRITE_COMBINED',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#aa0d69b2aa95680a6b2af6dc4dda44e16aef6b60397f05650d972d2cf55e3523eb',1,'cv::cuda::HostMem']]], - ['write_5fonly_270',['WRITE_ONLY',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a6b2a295dc840db8b6728db2f3a439d6eadca1f60cf44ecc42163b5f03318abb77',1,'cv::ogl::Buffer::WRITE_ONLY'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a1010adb068498c191b8079323ad790f9a7e7f7fcb59366af118874fb12865b52f',1,'cv::ocl::KernelArg::WRITE_ONLY']]], - ['writeaccessors_271',['WriteAccessors',['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5dabcadf08230fb1a5ef7b3195745d3a458',1,'Eigen::WriteAccessors'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5dabcadf08230fb1a5ef7b3195745d3a458',1,'WriteAccessors(Global Namespace)']]], - ['writeback_272',['writeBack',['https://docs.opencv.org/4.2.0/d2/d64/structcv_1_1detail_1_1scalar__wrapper.html#a6877f0aae02d7c07cce92951448fc488',1,'cv::detail::scalar_wrapper::writeBack()'],['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1detail_1_1scalar__wrapper__ocl.html#a9b6af8605efab7ff381ebd1f69ac2ea3',1,'cv::detail::scalar_wrapper_ocl::writeBack()']]], - ['writebinaryfile_273',['writeBinaryfile',['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html#a41a5eafba66fe2677d079ff157f19594',1,'cv::cnn_3dobj::icoSphere']]], - ['writeclass_274',['writeClass',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a150685aaacdd5e6b99361fdd72baac3d',1,'cv::linemod::Detector']]], - ['writeclasses_275',['writeClasses',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a5113da474bbd6558cff732dadc576c87',1,'cv::linemod::Detector']]], - ['writecloud_276',['writeCloud',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac2afffcdc8346762a0979664e9e2b249',1,'cv::viz::writeCloud()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac2afffcdc8346762a0979664e9e2b249',1,'writeCloud()(Global Namespace)']]], - ['writecomment_277',['writeComment',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a143eb62cf2c063095c005c0ac77a8823',1,'cv::FileStorage']]], - ['writefeature_278',['writeFeature',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#ac6e562852e9abb1fdada6114b20fa4fc',1,'cv::CvHaarEvaluator']]], - ['writefeatures_279',['writeFeatures',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a0b56b5cdb99ade4f0f2429875a529720',1,'cv::CvFeatureEvaluator::writeFeatures()'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a9b43b2bec3bdbbeebeb72dbff07c637b',1,'cv::CvHaarEvaluator::writeFeatures()'],['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#a32cf9ad66944e2052f3a958427348a9c',1,'cv::CvHOGEvaluator::writeFeatures()'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#a93592dff69ebefd2072335da62f170e2',1,'cv::CvLBPEvaluator::writeFeatures()']]], - ['writeformat_280',['writeFormat',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a68eeca71617474ad3d4561786f0289d2',1,'cv::Algorithm']]], - ['writeindex_281',['writeIndex',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#acb11de052da45de7be8d802c6b2b9d7a',1,'cv::AVIWriteContainer']]], - ['writelogmessage_282',['writeLogMessage',['https://docs.opencv.org/4.2.0/d9/dd4/namespacecv_1_1utils_1_1logging_1_1internal.html#acf0166b1abacd898a77f46d785ddef26',1,'cv::utils::logging::internal']]], - ['writelogmessageex_283',['writeLogMessageEx',['https://docs.opencv.org/4.2.0/d9/dd4/namespacecv_1_1utils_1_1logging_1_1internal.html#af91b3fd05f3ec7839d95a21617467628',1,'cv::utils::logging::internal']]], - ['writeonly_284',['WriteOnly',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#afb748ac6d3d227ab05d49a39b5d66726',1,'cv::ocl::KernelArg']]], - ['writeonlynosize_285',['WriteOnlyNoSize',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#ab9acb7ed46efc0b35330082fe3015f13',1,'cv::ocl::KernelArg']]], - ['writeopticalflow_286',['writeOpticalFlow',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gad6e34461a92d7716d581567e8b06a550',1,'cv::writeOpticalFlow()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gad6e34461a92d7716d581567e8b06a550',1,'writeOpticalFlow()(Global Namespace)']]], - ['writeparameters_287',['writeParameters',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#a02695657ee01e5a5aa5746000816f050',1,'cv::multicalib::MultiCameraCalibration']]], - ['writeply_288',['writePLY',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga72ffa4c73f214a573cb4028e015c4adb',1,'cv::ppf_match_3d::writePLY()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga72ffa4c73f214a573cb4028e015c4adb',1,'writePLY()(Global Namespace)']]], - ['writeplyvisiblenormals_289',['writePLYVisibleNormals',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga965333522cfe06814478dec8ffa4cd41',1,'cv::ppf_match_3d::writePLYVisibleNormals()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga965333522cfe06814478dec8ffa4cd41',1,'writePLYVisibleNormals()(Global Namespace)']]], - ['writepose_290',['writePose',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a862206978d42ff33da0b73467c8c639f',1,'cv::ppf_match_3d::Pose3D::writePose(FILE *f)'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a89cec144db41d73c638feed401128f3f',1,'cv::ppf_match_3d::Pose3D::writePose(const std::string &FileName)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga3d25aaecb4a692f446179fed36eeb1b4',1,'cv::viz::writePose()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga3d25aaecb4a692f446179fed36eeb1b4',1,'writePose()(Global Namespace)']]], - ['writeposecluster_291',['writePoseCluster',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a022b8e9e02a92a5303690ca8cc001acd',1,'cv::ppf_match_3d::PoseCluster3D::writePoseCluster(FILE *f)'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a7557d1bb33423b90f9bbf7e2be47aece',1,'cv::ppf_match_3d::PoseCluster3D::writePoseCluster(const std::string &FileName)']]], - ['writer_292',['writer',['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a8d73b66ca5bc85ec071052ed7f417b5f',1,'cv::VideoWriter']]], - ['writeraw_293',['writeRaw',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a513583eecda2e5e3c3b26e328448c123',1,'cv::FileStorage']]], - ['writescalar_294',['writeScalar',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae8c1ed7775a9692dd5a04e7b9c257332',1,'cv::FileStorage::writeScalar(FileStorage &fs, int value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ad3dab4054c2a10a45238fd10d11f280e',1,'cv::FileStorage::writeScalar(FileStorage &fs, float value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ac4ec3e0ff8321cd7a2b312e275d1b7ba',1,'cv::FileStorage::writeScalar(FileStorage &fs, double value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a2a8da1ead8d174f9244b5e8593ebd1d8',1,'cv::FileStorage::writeScalar(FileStorage &fs, const String &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae8c1ed7775a9692dd5a04e7b9c257332',1,'cv::FileStorage::writeScalar(FileStorage &fs, int value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ad3dab4054c2a10a45238fd10d11f280e',1,'cv::FileStorage::writeScalar(FileStorage &fs, float value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ac4ec3e0ff8321cd7a2b312e275d1b7ba',1,'cv::FileStorage::writeScalar(FileStorage &fs, double value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a2a8da1ead8d174f9244b5e8593ebd1d8',1,'cv::FileStorage::writeScalar(FileStorage &fs, const String &value)']]], - ['writestreamheader_295',['writeStreamHeader',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a1dfee94302648b5020638320f20108a4',1,'cv::AVIWriteContainer']]], - ['writetextgraph_296',['writeTextGraph',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga0c3f216f5f858efdef44b68636133dff',1,'cv::dnn::writeTextGraph()'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga0c3f216f5f858efdef44b68636133dff',1,'writeTextGraph()(Global Namespace)']]], - ['writetofilestorage_297',['writeToFileStorage',['../classcam_1_1CameraParams.html#a2b2311039851a446ad081f6532bc6c15',1,'cam::CameraParams']]], - ['writetrajectory_298',['writeTrajectory',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga62f87da85e4c2cc315918beb449bd706',1,'cv::viz::writeTrajectory()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga62f87da85e4c2cc315918beb449bd706',1,'writeTrajectory(InputArray traj, const String &files_format="pose%05d.xml", int start=0, const String &tag="pose")(Global Namespace)']]], - ['writing_299',['Image file reading and writing',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html',1,'']]], - ['writing_20and_20reading_20datasets_300',['Creating, Writing and Reading Datasets',['https://docs.opencv.org/4.2.0/d4/d93/tutorial_hdf_create_read_write_datasets.html',1,'']]], - ['writing_20attributes_301',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]], - ['writing_20documentation_20for_20opencv_302',['Writing documentation for OpenCV',['https://docs.opencv.org/4.2.0/d4/db1/tutorial_documentation.html',1,'']]], - ['writing_20efficient_20matrix_20product_20expressions_303',['Writing efficient matrix product expressions',['https://eigen.tuxfamily.org/dox/TopicWritingEfficientProductExpression.html',1,'']]], - ['writing_20functions_20taking_20eigen_20types_20as_20parameters_304',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], - ['written_20data_20using_20knn_305',['OCR of Hand-written Data using kNN',['https://docs.opencv.org/4.2.0/d8/d4b/tutorial_py_knn_opencv.html',1,'']]], - ['written_20data_20using_20svm_306',['OCR of Hand-written Data using SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'']]], - ['wrong_20assumption_20on_20stack_20alignment_307',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], - ['wrong_5fobject_308',['WRONG_OBJECT',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ad43563cc5b954817ad5078f995afd3ffaf4b74b622d1802cbb6573c8b1148c953',1,'cv::DetectionBasedTracker']]], - ['ws_309',['ws',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad864c3d25c6f09088c3a6e8d22151a5d',1,'std']]], - ['wscale_310',['wscale',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#aafa6d7b275138dd568afb41a388c2fc4',1,'cv::ocl::KernelArg']]], - ['wsphere_311',['WSphere',['https://docs.opencv.org/4.2.0/d1/da7/classcv_1_1viz_1_1WSphere.html',1,'cv::viz::WSphere'],['https://docs.opencv.org/4.2.0/d1/da7/classcv_1_1viz_1_1WSphere.html#ac9d7e5ab6678319eb3194fcc5a3f727a',1,'cv::viz::WSphere::WSphere()']]], - ['wsregex_5ftoken_5fiterator_312',['wsregex_token_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga45d6a7c3f216b9e231d6bfbe2f405821',1,'std::wsregex_token_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga45d6a7c3f216b9e231d6bfbe2f405821',1,'wsregex_token_iterator(Global Namespace)']]], - ['wssub_5fmatch_313',['wssub_match',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga093a1ad2914d74a3fafb7baa78a3deb6',1,'std::wssub_match'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga093a1ad2914d74a3fafb7baa78a3deb6',1,'wssub_match(Global Namespace)']]], - ['wstreambuf_314',['wstreambuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga72040b852b537e306ce9c862698e0e07',1,'std::wstreambuf'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga72040b852b537e306ce9c862698e0e07',1,'wstreambuf(Global Namespace)']]], - ['wstreampos_315',['wstreampos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4c451a38ccf44b2ce7d8aadf02bb6309',1,'std']]], - ['wstring_316',['wstring',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01516.html#gacc5a707e71ec50089cb9f653282f22f7',1,'std::wstring'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01516.html#gacc5a707e71ec50089cb9f653282f22f7',1,'wstring(Global Namespace)']]], - ['wstring_5fconvert_317',['wstring_convert',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html',1,'std::wstring_convert< class, class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a26644c46ef7342d3536fc89f0f905cb5',1,'std::wstring_convert::wstring_convert()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a1db78585f8e05fe4515a96d668379bb5',1,'std::wstring_convert::wstring_convert(_Codecvt *__pcvt)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#ac63cbe7aac1dc89a72e1e40134545d41',1,'std::wstring_convert::wstring_convert(_Codecvt *__pcvt, state_type __state)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#aa7882cf7b53baff7d6d2cf9ca3386b3a',1,'std::wstring_convert::wstring_convert(const byte_string &__byte_err, const wide_string &__wide_err=wide_string())']]], - ['wstringbuf_318',['wstringbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga4e78c6817168947842caf24c3ffd5352',1,'std::wstringbuf'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga4e78c6817168947842caf24c3ffd5352',1,'wstringbuf(Global Namespace)']]], - ['wstringstream_319',['wstringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gabd6a5fd8237370934ed97cc2e77b7021',1,'std::wstringstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gabd6a5fd8237370934ed97cc2e77b7021',1,'wstringstream(Global Namespace)']]], - ['wtext_320',['WText',['https://docs.opencv.org/4.2.0/de/d0b/classcv_1_1viz_1_1WText.html',1,'cv::viz::WText'],['https://docs.opencv.org/4.2.0/de/d0b/classcv_1_1viz_1_1WText.html#af98383ae4571f39563c0ce8afdf41053',1,'cv::viz::WText::WText()']]], - ['wtext3d_321',['WText3D',['https://docs.opencv.org/4.2.0/d6/d3d/classcv_1_1viz_1_1WText3D.html',1,'cv::viz::WText3D'],['https://docs.opencv.org/4.2.0/d6/d3d/classcv_1_1viz_1_1WText3D.html#a88a78943e58fa5726482a96b21e2dba0',1,'cv::viz::WText3D::WText3D()']]], - ['wtrajectory_322',['WTrajectory',['https://docs.opencv.org/4.2.0/d0/da3/classcv_1_1viz_1_1WTrajectory.html',1,'cv::viz::WTrajectory'],['https://docs.opencv.org/4.2.0/d0/da3/classcv_1_1viz_1_1WTrajectory.html#adea00ca972dff63b1dcf06fcfe65b02c',1,'cv::viz::WTrajectory::WTrajectory()']]], - ['wtrajectoryfrustums_323',['WTrajectoryFrustums',['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1viz_1_1WTrajectoryFrustums.html',1,'cv::viz::WTrajectoryFrustums'],['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1viz_1_1WTrajectoryFrustums.html#a584bdf50379fd90dd3775e33b275152a',1,'cv::viz::WTrajectoryFrustums::WTrajectoryFrustums(InputArray path, const Matx33d &K, double scale=1., const Color &color=Color::white())'],['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1viz_1_1WTrajectoryFrustums.html#a5dd5e11a871978843a726de1f82f69ff',1,'cv::viz::WTrajectoryFrustums::WTrajectoryFrustums(InputArray path, const Vec2d &fov, double scale=1., const Color &color=Color::white())']]], - ['wtrajectoryspheres_324',['WTrajectorySpheres',['https://docs.opencv.org/4.2.0/d4/dca/classcv_1_1viz_1_1WTrajectorySpheres.html',1,'cv::viz::WTrajectorySpheres'],['https://docs.opencv.org/4.2.0/d4/dca/classcv_1_1viz_1_1WTrajectorySpheres.html#ac41ba95b84ce2883a4e647bb79db27d4',1,'cv::viz::WTrajectorySpheres::WTrajectorySpheres()']]], - ['wwidgetmerger_325',['WWidgetMerger',['https://docs.opencv.org/4.2.0/df/d97/classcv_1_1viz_1_1WWidgetMerger.html',1,'cv::viz::WWidgetMerger'],['https://docs.opencv.org/4.2.0/df/d97/classcv_1_1viz_1_1WWidgetMerger.html#abb0dfc2f9877faae37f53eb61beb58e2',1,'cv::viz::WWidgetMerger::WWidgetMerger()']]], - ['wx_326',['Wx',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#a5db659a99ea517f666e0d75e261ad4b5',1,'cv::datasets::join']]], - ['wy_327',['Wy',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#aed76f4f61e9c07356e87c9614211565d',1,'cv::datasets::join']]], - ['wz_328',['Wz',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#a64fa0cf136bece7c7c10dac726c2acc0',1,'cv::datasets::join']]] + ['with_20opencv_195',['Camera calibration With OpenCV',['https://docs.opencv.org/4.2.0/d4/d94/tutorial_camera_calibration.html',1,'']]], + ['with_20opencv_196',['with OpenCV',['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'Android Development with OpenCV'],['https://docs.opencv.org/4.2.0/d7/d9e/tutorial_video_write.html',1,'Creating a video with OpenCV'],['https://docs.opencv.org/4.2.0/da/d60/tutorial_face_main.html',1,'Face Recognition with OpenCV'],['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'How to scan images, lookup tables and time measurement with OpenCV'],['https://docs.opencv.org/4.2.0/df/d61/tutorial_random_generator_and_text.html',1,'Random generator and text with OpenCV']]], + ['with_20opencv_20and_20similarity_20measurement_197',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], + ['with_20opencv_20inside_20the_20microsoft_20visual_20studio_198',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['with_20opencv_20overview_199',['Video I/O with OpenCV Overview',['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'']]], + ['with_20raw_20buffers_3a_20the_20map_20class_200',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], + ['with_20square_20chessboard_201',['Camera calibration with square chessboard',['https://docs.opencv.org/4.2.0/dc/d43/tutorial_camera_calibration_square_chess.html',1,'']]], + ['with_20thrust_202',['Using a cv::cuda::GpuMat with thrust',['https://docs.opencv.org/4.2.0/d8/db9/tutorial_gpu_thrust_interop.html',1,'']]], + ['with_20tt_20clang_20format_20tt_203',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], + ['with_20videos_204',['with Videos',['https://docs.opencv.org/4.2.0/dd/d43/tutorial_py_video_display.html',1,'Getting Started with Videos'],['https://docs.opencv.org/4.2.0/dd/d00/tutorial_js_video_display.html',1,'Getting Started with Videos']]], + ['with_20watershed_20algorithm_205',['with Watershed Algorithm',['https://docs.opencv.org/4.2.0/d3/db4/tutorial_py_watershed.html',1,'Image Segmentation with Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d7/d1c/tutorial_js_watershed.html',1,'Image Segmentation with Watershed Algorithm']]], + ['withdepth_206',['withDepth',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a82c512d99a4ed51a3372b78a9ddc8dce',1,'cv::GMatDesc']]], + ['withformat_207',['WithFormat',['https://eigen.tuxfamily.org/dox/classEigen_1_1WithFormat.html',1,'Eigen']]], + ['withoutmask_208',['WithOutMask',['https://docs.opencv.org/4.2.0/da/d2c/structcv_1_1cudev_1_1WithOutMask.html',1,'cv::cudev']]], + ['withsize_209',['withSize',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#aa0a8e3b6f80aede6415e0ea5b0dc3515',1,'cv::GMatDesc::withSize(cv::Size sz) const'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a84cf854c735e32aee07fb4ad5b56ea80',1,'cv::GMatDesc::withSize(cv::gapi::own::Size sz) const']]], + ['withsizedelta_210',['withSizeDelta',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#af77162706a109db4e2f72cc5f1696ad7',1,'cv::GMatDesc::withSizeDelta(cv::gapi::own::Size delta) const'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a9210d5700cc720d70bf3df2e2374ee02',1,'cv::GMatDesc::withSizeDelta(cv::Size delta) const'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#ac3da6d65d65160b358670d6566747f35',1,'cv::GMatDesc::withSizeDelta(int dx, int dy) const']]], + ['withtype_211',['withType',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a2a7556619457489e32202631f0e0414e',1,'cv::GMatDesc']]], + ['wline_212',['WLine',['https://docs.opencv.org/4.2.0/d6/d8e/classcv_1_1viz_1_1WLine.html',1,'cv::viz::WLine'],['https://docs.opencv.org/4.2.0/d6/d8e/classcv_1_1viz_1_1WLine.html#ac2215e5beee395b25ca5f1e0c20aebc7',1,'cv::viz::WLine::WLine()']]], + ['wmesh_213',['WMesh',['https://docs.opencv.org/4.2.0/d2/d76/classcv_1_1viz_1_1WMesh.html',1,'cv::viz::WMesh'],['https://docs.opencv.org/4.2.0/d2/d76/classcv_1_1viz_1_1WMesh.html#a14289d8a4b99950edf0c1fb855730ae4',1,'cv::viz::WMesh::WMesh(const Mesh &mesh)'],['https://docs.opencv.org/4.2.0/d2/d76/classcv_1_1viz_1_1WMesh.html#a5023e5228d28ea876415140312b24415',1,'cv::viz::WMesh::WMesh(InputArray cloud, InputArray polygons, InputArray colors=noArray(), InputArray normals=noArray())']]], + ['wmf_5fcos_214',['WMF_COS',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6a0cd93f618be5627d6998ea43a7532a69',1,'cv::ximgproc']]], + ['wmf_5fexp_215',['WMF_EXP',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6a7bb4cc9c7bc728a9e29b4503952e47a2',1,'cv::ximgproc']]], + ['wmf_5fiv1_216',['WMF_IV1',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6ab180d3fd333a0829c17db4036f010036',1,'cv::ximgproc']]], + ['wmf_5fiv2_217',['WMF_IV2',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6af5f9edde9a1f3b6ca9b7fe81b28b2cb9',1,'cv::ximgproc']]], + ['wmf_5fjac_218',['WMF_JAC',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6ac59ff751a6f0f28092383279e0631e75',1,'cv::ximgproc']]], + ['wmf_5foff_219',['WMF_OFF',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6a623aacf6d30cafdadc49b52749a3a1f6',1,'cv::ximgproc']]], + ['wmfweighttype_220',['WMFWeightType',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#ae01330ec6648a4971b7aa3076b595cd6',1,'cv::ximgproc']]], + ['wnd_5fprop_5faspect_5fratio_221',['WND_PROP_ASPECT_RATIO',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a635a6ff3b81e4019be4a43b64e7b2bbb',1,'cv::WND_PROP_ASPECT_RATIO'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a635a6ff3b81e4019be4a43b64e7b2bbb',1,'WND_PROP_ASPECT_RATIO(Global Namespace)']]], + ['wnd_5fprop_5fautosize_222',['WND_PROP_AUTOSIZE',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a40b8385d11a44871776eed13da7808a2',1,'cv::WND_PROP_AUTOSIZE'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a40b8385d11a44871776eed13da7808a2',1,'WND_PROP_AUTOSIZE(Global Namespace)']]], + ['wnd_5fprop_5ffullscreen_223',['WND_PROP_FULLSCREEN',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a3b6a89b0daf2149dab93f9c6ab99fcc8',1,'cv::WND_PROP_FULLSCREEN'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a3b6a89b0daf2149dab93f9c6ab99fcc8',1,'WND_PROP_FULLSCREEN(Global Namespace)']]], + ['wnd_5fprop_5fopengl_224',['WND_PROP_OPENGL',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a360f30201f153e192919289d7c002e04',1,'cv::WND_PROP_OPENGL'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a360f30201f153e192919289d7c002e04',1,'WND_PROP_OPENGL(Global Namespace)']]], + ['wnd_5fprop_5ftopmost_225',['WND_PROP_TOPMOST',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a2a1ae9effa9adebfde8c7d853f0182c0',1,'cv::WND_PROP_TOPMOST'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a2a1ae9effa9adebfde8c7d853f0182c0',1,'WND_PROP_TOPMOST(Global Namespace)']]], + ['wnd_5fprop_5fvisible_226',['WND_PROP_VISIBLE',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a07598b61a8b3047cb93634130beddf81',1,'cv::WND_PROP_VISIBLE'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaeedf4023e777f896ba6b9ffb156f57b8a07598b61a8b3047cb93634130beddf81',1,'WND_PROP_VISIBLE(Global Namespace)']]], + ['wobble_5fsuppression_2ehpp_227',['wobble_suppression.hpp',['https://docs.opencv.org/4.2.0/d0/df9/wobble__suppression_8hpp.html',1,'']]], + ['wobblesuppressor_228',['wobbleSuppressor',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a764d3f09e4906ef6e5ec7f1a3686fea1',1,'cv::videostab::TwoPassStabilizer']]], + ['wobblesuppressor_5f_229',['wobbleSuppressor_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a846fdfe7df7f6e9734ae98f033f2b8b0',1,'cv::videostab::TwoPassStabilizer']]], + ['wobblesuppressorbase_230',['WobbleSuppressorBase',['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html',1,'cv::videostab::WobbleSuppressorBase'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a5067ab72f26aec1b3dbe346569a2a08b',1,'cv::videostab::WobbleSuppressorBase::WobbleSuppressorBase()']]], + ['wofstream_231',['wofstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gab5d4d2c5ad9ee70018becc9002629a71',1,'std::wofstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gab5d4d2c5ad9ee70018becc9002629a71',1,'wofstream(Global Namespace)']]], + ['woodenboard_232',['woodenBoard',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ggaf7e286a941a896732aa34847bab9b182adb140e2810e33fb6d03e068628421923',1,'cv::datasets::woodenBoard'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ggaf7e286a941a896732aa34847bab9b182adb140e2810e33fb6d03e068628421923',1,'woodenBoard(Global Namespace)']]], + ['word_233',['word',['https://docs.opencv.org/4.2.0/d7/d98/structcv_1_1datasets_1_1word.html',1,'cv::datasets']]], + ['words_234',['words',['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1datasets_1_1TR__icdarObj.html#a282faa1ce4484e4eda98969d124cd2c2',1,'cv::datasets::TR_icdarObj']]], + ['work_5ftype_235',['work_type',['https://docs.opencv.org/4.2.0/da/dad/structcv_1_1cudev_1_1Avg.html#aaf77aea7cf2f2b0b9ac0095468bb58cf',1,'cv::cudev::Avg::work_type'],['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1cudev_1_1Max.html#ab99c93dcaad74858a575e0e376677819',1,'cv::cudev::Max::work_type'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1Min.html#a918e142b2d587b51557d77ead9093bd1',1,'cv::cudev::Min::work_type'],['https://docs.opencv.org/4.2.0/d8/d60/structcv_1_1cudev_1_1Sum.html#aa63302b148d3b07fb231f47872f535db',1,'cv::cudev::Sum::work_type']]], + ['workcycleobjectdetectorfunction_236',['workcycleObjectDetectorFunction',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#acbbf5473e3e123f3a376397d703a67af',1,'cv::DetectionBasedTracker']]], + ['workgroupsize_237',['workGroupSize',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#ad4d8b8b503683b9ab5764e4faa54984a',1,'cv::ocl::Kernel']]], + ['working_20with_20different_20datasets_238',['Framework for working with different datasets',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html',1,'']]], + ['works_239',['How OpenCV-Python Bindings Works?',['https://docs.opencv.org/4.2.0/da/d49/tutorial_py_bindings_basics.html',1,'']]], + ['workscale_240',['workScale',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a69f0feb213330d7e4806892867ac4249',1,'cv::Stitcher']]], + ['workstealing_2eh_241',['workstealing.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00983.html',1,'']]], + ['world_20vision_242',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], + ['world_5finterface_243',['WORLD_INTERFACE',['../namespacerobot.html#ad2a31e2720609dd7619fc2bbafcf441e',1,'robot']]], + ['world_5finterface_5finit_244',['world_interface_init',['../namespacerobot.html#a65584ffb83e20412a795461b921deb5f',1,'robot']]], + ['worldinterface_245',['WorldInterface',['../namespacerobot.html#a81cb1706e1f0e7c0639e231446ce4c9e',1,'robot']]], + ['wostream_246',['wostream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga9ad6702c06821cdd550e08ef2b70f3b7',1,'std::wostream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga9ad6702c06821cdd550e08ef2b70f3b7',1,'wostream(Global Namespace)']]], + ['wostringstream_247',['wostringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga811d6452576dc4c2fccd0ab26fd23f07',1,'std::wostringstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga811d6452576dc4c2fccd0ab26fd23f07',1,'wostringstream(Global Namespace)']]], + ['wpaintedcloud_248',['WPaintedCloud',['https://docs.opencv.org/4.2.0/db/de8/classcv_1_1viz_1_1WPaintedCloud.html',1,'cv::viz::WPaintedCloud'],['https://docs.opencv.org/4.2.0/db/de8/classcv_1_1viz_1_1WPaintedCloud.html#a2e0baaa4cade67743997d621663d03fa',1,'cv::viz::WPaintedCloud::WPaintedCloud(InputArray cloud)'],['https://docs.opencv.org/4.2.0/db/de8/classcv_1_1viz_1_1WPaintedCloud.html#ab68a1a7049074405bd4f3f6f515b44f5',1,'cv::viz::WPaintedCloud::WPaintedCloud(InputArray cloud, const Point3d &p1, const Point3d &p2)'],['https://docs.opencv.org/4.2.0/db/de8/classcv_1_1viz_1_1WPaintedCloud.html#af11520c9484ab6bef4bbaa865bc06da3',1,'cv::viz::WPaintedCloud::WPaintedCloud(InputArray cloud, const Point3d &p1, const Point3d &p2, const Color &c1, const Color c2)']]], + ['wplane_249',['WPlane',['https://docs.opencv.org/4.2.0/d8/d01/classcv_1_1viz_1_1WPlane.html',1,'cv::viz::WPlane'],['https://docs.opencv.org/4.2.0/d8/d01/classcv_1_1viz_1_1WPlane.html#a7e90024f2cd4702ae8a866eae190b244',1,'cv::viz::WPlane::WPlane(const Size2d &size=Size2d(1.0, 1.0), const Color &color=Color::white())'],['https://docs.opencv.org/4.2.0/d8/d01/classcv_1_1viz_1_1WPlane.html#ad2f8a3587414f568db549a3a44a85831',1,'cv::viz::WPlane::WPlane(const Point3d &center, const Vec3d &normal, const Vec3d &new_yaxis, const Size2d &size=Size2d(1.0, 1.0), const Color &color=Color::white())']]], + ['wpolyline_250',['WPolyLine',['https://docs.opencv.org/4.2.0/de/ddb/classcv_1_1viz_1_1WPolyLine.html',1,'cv::viz::WPolyLine'],['https://docs.opencv.org/4.2.0/de/ddb/classcv_1_1viz_1_1WPolyLine.html#a456e068ad7263ee03df21b309dd5d9a2',1,'cv::viz::WPolyLine::WPolyLine(InputArray points, InputArray colors)'],['https://docs.opencv.org/4.2.0/de/ddb/classcv_1_1viz_1_1WPolyLine.html#af72ef02dec6f4a8d573890b8604ca09d',1,'cv::viz::WPolyLine::WPolyLine(InputArray points, const Color &color=Color::white())']]], + ['wrap_251',['wrap',['https://docs.opencv.org/4.2.0/d9/d7d/structcv_1_1detail_1_1WrapValue.html#ad04caed470836f37d609b4778558d0a7',1,'cv::detail::WrapValue']]], + ['wrap_5fgapi_5fhelper_252',['wrap_gapi_helper',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a36b52c324bc6d7c82b480deeeb6766ae',1,'cv::detail']]], + ['wrap_5fhost_5fhelper_253',['wrap_host_helper',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#af4fa8b5545a2e8a78239f1b452706ecf',1,'cv::detail']]], + ['wrap_5fin_254',['wrap_in',['https://docs.opencv.org/4.2.0/da/d1b/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GArray_3_01T_01_4_01_4.html#a5a541dfa504b30b5407d2db322b5ac36',1,'cv::detail::GTypeTraits< cv::GArray< T > >::wrap_in()'],['https://docs.opencv.org/4.2.0/d9/d7d/structcv_1_1detail_1_1WrapValue.html#aaa1c2a817c4b76bb3a373055e5e913c1',1,'cv::detail::WrapValue::wrap_in()']]], + ['wrap_5fkernel_255',['wrap_kernel',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a2927f9b915e5d02ff0e943ddc0efbeca',1,'cv::TrackerKCF::Params']]], + ['wrap_5fout_256',['wrap_out',['https://docs.opencv.org/4.2.0/da/d1b/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GArray_3_01T_01_4_01_4.html#a998319a3020e3deb96b1b838fb12d519',1,'cv::detail::GTypeTraits< cv::GArray< T > >::wrap_out()'],['https://docs.opencv.org/4.2.0/d9/d7d/structcv_1_1detail_1_1WrapValue.html#a1623c10984c912c223c7074572074cfe',1,'cv::detail::WrapValue::wrap_out()']]], + ['wrap_5fvalue_257',['wrap_value',['https://docs.opencv.org/4.2.0/da/d1b/structcv_1_1detail_1_1GTypeTraits_3_01cv_1_1GArray_3_01T_01_4_01_4.html#a9d31069a644ac8142a480db3fefa42ee',1,'cv::detail::GTypeTraits< cv::GArray< T > >']]], + ['wrapevent_258',['wrapEvent',['https://docs.opencv.org/4.2.0/da/d71/structcv_1_1cuda_1_1EventAccessor.html#a20adf37615b96e3b5b59b2f6eb931cce',1,'cv::cuda::EventAccessor']]], + ['wrapper_259',['Const-propagating wrapper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01526.html',1,'']]], + ['wrapperemd_260',['wrapperEMD',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga31fdda0864e64ca6b9de252a2611758b',1,'cv::wrapperEMD()'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga31fdda0864e64ca6b9de252a2611758b',1,'wrapperEMD()(Global Namespace)']]], + ['wrapstream_261',['wrapStream',['https://docs.opencv.org/4.2.0/d6/df1/structcv_1_1cuda_1_1StreamAccessor.html#a4fa7571e434f78b461efcd0e52dc8132',1,'cv::cuda::StreamAccessor']]], + ['wrapvalue_262',['WrapValue',['https://docs.opencv.org/4.2.0/d9/d7d/structcv_1_1detail_1_1WrapValue.html',1,'cv::detail']]], + ['wref_263',['wref',['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html#a81a3ac44db5256abb0fe57ececda2383',1,'cv::detail::VectorRef::wref()'],['https://docs.opencv.org/4.2.0/d2/dab/classcv_1_1detail_1_1VectorRefT.html#a912902c204688d90ef0f742009158ef6',1,'cv::detail::VectorRefT::wref()']]], + ['wregex_264',['wregex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae16f87e70ea5847b0399a396c637615f',1,'std::wregex'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae16f87e70ea5847b0399a396c637615f',1,'wregex(Global Namespace)']]], + ['write_265',['WRITE',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da747a241cefee7b8af34c3d804c864ad6',1,'cv::FileStorage']]], + ['write_266',['write',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a1f8ad7b8add515077367fb9949a174d2',1,'cv::Algorithm::write(FileStorage &fs) const'],['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a763a62d1b03042eef7d7fc3ac6c87c79',1,'cv::Algorithm::write(const Ptr< FileStorage > &fs, const String &name=String()) const'],['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html#a7f0e55c29e3c982f389cf601141359ac',1,'cv::face::BasicFaceRecognizer::write()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a7e39bfe7462f22ba08b11474827c68eb',1,'cv::line_descriptor::BinaryDescriptor::write()'],['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a5fb3cc4af2c17519e9901c9f5fa29047',1,'cv::linemod::ColorGradient::write()'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#a7fc483d903a6cf340b5446c092c86ea7',1,'cv::CvFeatureParams::write()'],['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#ad4bee2484c21cc717e01efd01d7afb88',1,'cv::CvHaarFeatureParams::write()'],['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html#a7020bf3bafcb950c8244c08eb38cf117',1,'cv::CvParams::write()'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a0f08a979b7d0d2fda254c2b450379477',1,'cv::linemod::DepthNormal::write()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a9e848d967aaed6930da407f338ca17ba',1,'cv::DescriptorMatcher::write(const String &fileName) const'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#abcba89024601e88afe6e4cc2349798c3',1,'cv::DescriptorMatcher::write(FileStorage &) const CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#ad516a0d4afa280c256123e082a1e02c1',1,'cv::DescriptorMatcher::write(const Ptr< FileStorage > &fs, const String &name=String()) const'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a45ad63d73e6ff0967b1f479912801a95',1,'cv::linemod::Detector::write()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#a2adf2d555550194244b05c91fefcb4d6',1,'cv::face::FaceRecognizer::write(const String &filename) const'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#a4756dbf9b97408ba5f3677296c3a1695',1,'cv::face::FaceRecognizer::write(FileStorage &fs) const CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d9/db9/structcv_1_1linemod_1_1Feature.html#a1e2bfa2a6eb9d9c79c603cccb92809b8',1,'cv::linemod::Feature::write()'],['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#ad941791a15015544f77b04b0d4b19f95',1,'cv::CvHOGEvaluator::Feature::write(FileStorage &fs) const'],['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#ae27012db6a9f5da0a03ebee7defc49fa',1,'cv::CvHOGEvaluator::Feature::write(FileStorage &fs, int varIdx) const'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html#acb9f30b27f452cd7248357b590055d02',1,'cv::CvLBPEvaluator::Feature::write()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a856b4bc1303a7ee8fcec452c7c62f969',1,'cv::Feature2D::write(const String &fileName) const'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a45193ec538b7178e5ce6f38394ca131a',1,'cv::Feature2D::write(FileStorage &) const CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a9805c698c6ec2ef90bd6b40efddcc257',1,'cv::Feature2D::write(const Ptr< FileStorage > &fs, const String &name=String()) const'],['https://docs.opencv.org/4.2.0/d3/d52/classcv_1_1CvHaarEvaluator_1_1FeatureHaar.html#aa5457df5ecb3d1037a44841002bb4144',1,'cv::CvHaarEvaluator::FeatureHaar::write()'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a3efd38c576bac8b66281826f0a2642e7',1,'cv::FileStorage::write(const String &name, int val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af9597d58d64dff5cc998344bc4b1c1f0',1,'cv::FileStorage::write(const String &name, double val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a0466680193c966dbeef4e508aebfe8aa',1,'cv::FileStorage::write(const String &name, const String &val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a5335e0f3caa5d44d79edcafcbc0091d8',1,'cv::FileStorage::write(const String &name, const Mat &val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9d9ee20427f73c94ee89ce893831614a',1,'cv::FileStorage::write(const String &name, const std::vector< String > &val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a26447446dd3fa0644684a045e16399fe',1,'cv::FileStorage::write(FileStorage &fs, const String &name, int value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aebc12a5356bcba8393d9f1fbf901065b',1,'cv::FileStorage::write(FileStorage &fs, const String &name, float value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a598e853f2001864e2c709d7726ad29b7',1,'cv::FileStorage::write(FileStorage &fs, const String &name, double value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a63a75e0be408d41f9dea527a1c960286',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const String &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a403766cfd06a4c7fc56f3a6187fabc35',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Mat &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9d8021889a9984dee8c7913fde569cff',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const SparseMat &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a24430b807ccd2cf002058961cd2e3263',1,'cv::FileStorage::write(FileStorage &fs, const _Tp &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9588e05768869430821699ae6b1eb28d',1,'cv::FileStorage::write(FileStorage &fs, const int &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ac229241c6dd16bb343de5aeee197db03',1,'cv::FileStorage::write(FileStorage &fs, const float &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa0e3cc864beb06182c8c2826a8d0cdb8',1,'cv::FileStorage::write(FileStorage &fs, const double &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a058d1227fa81fbf9ffc926d1a2485f3d',1,'cv::FileStorage::write(FileStorage &fs, const String &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa627e4c875c46d7830fb6d0ac1431e00',1,'cv::FileStorage::write(FileStorage &fs, const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ad2ecdf5485d88536eb7c97662a428a4e',1,'cv::FileStorage::write(FileStorage &fs, const Point3_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9700290bb5ec6b5c890bc0d251855f61',1,'cv::FileStorage::write(FileStorage &fs, const Size_< _Tp > &sz)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a843319acfe360410e8cfcff1749aa5b0',1,'cv::FileStorage::write(FileStorage &fs, const Complex< _Tp > &c)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#abff24d9b3462a4d368e864b09c62de46',1,'cv::FileStorage::write(FileStorage &fs, const Rect_< _Tp > &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a5d8a4afcb9a84c5705605b6456f0bf4a',1,'cv::FileStorage::write(FileStorage &fs, const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#afcf3219ea83b2e466f0d9631ea53d7a3',1,'cv::FileStorage::write(FileStorage &fs, const Matx< _Tp, m, n > &x)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a54bf874d535dfc61b08fff99e7b5e8ab',1,'cv::FileStorage::write(FileStorage &fs, const Scalar_< _Tp > &s)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#acb53272996fd5a25ca077aeb5385a9a3',1,'cv::FileStorage::write(FileStorage &fs, const Range &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af710db7aa40918f5429ba8e78622d08f',1,'cv::FileStorage::write(FileStorage &fs, const std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a04c8f9337b9d9821114f951faee80bae',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a550f8a4931274589cdc5a3796c2eef48',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Point3_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a84453625335849d8ec1a0df6c865b0cb',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Size_< _Tp > &sz)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ace7fc76da8b2a634a5c83183700f0bbb',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Complex< _Tp > &c)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a43c8a8a86952cff8b062e18c9f3e72cc',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Rect_< _Tp > &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a893a9ed023837feb61f7fe804d21cb40',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae11814668aa0bf1957b8c612eaac033d',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Matx< _Tp, m, n > &x)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a6f13874950203b1bbbe4ec4fee5eb6a1',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Scalar_< _Tp > &s)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#addda29520f80f53e144a5e15b57ec98d',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Range &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a1fcc9cf302523a5ab15f62f77a3bd6dd',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const KeyPoint &kpt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa7eda7701e29ddfcba1ce21615113c67',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const DMatch &m)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ac1f774dd8fb03a6b5207e022d3553f2d',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const _Tp &val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a6e3ddba0ac9a82d6f7817f9db1aa2556',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af9feef3fb24eb47d9a665056977d1183',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const std::vector< std::vector< _Tp > > &vec)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a26447446dd3fa0644684a045e16399fe',1,'cv::FileStorage::write(FileStorage &fs, const String &name, int value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aebc12a5356bcba8393d9f1fbf901065b',1,'cv::FileStorage::write(FileStorage &fs, const String &name, float value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a598e853f2001864e2c709d7726ad29b7',1,'cv::FileStorage::write(FileStorage &fs, const String &name, double value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a63a75e0be408d41f9dea527a1c960286',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const String &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a403766cfd06a4c7fc56f3a6187fabc35',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Mat &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9d8021889a9984dee8c7913fde569cff',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const SparseMat &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a24430b807ccd2cf002058961cd2e3263',1,'cv::FileStorage::write(FileStorage &fs, const _Tp &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9588e05768869430821699ae6b1eb28d',1,'cv::FileStorage::write(FileStorage &fs, const int &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ac229241c6dd16bb343de5aeee197db03',1,'cv::FileStorage::write(FileStorage &fs, const float &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa0e3cc864beb06182c8c2826a8d0cdb8',1,'cv::FileStorage::write(FileStorage &fs, const double &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a058d1227fa81fbf9ffc926d1a2485f3d',1,'cv::FileStorage::write(FileStorage &fs, const String &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa627e4c875c46d7830fb6d0ac1431e00',1,'cv::FileStorage::write(FileStorage &fs, const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ad2ecdf5485d88536eb7c97662a428a4e',1,'cv::FileStorage::write(FileStorage &fs, const Point3_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a9700290bb5ec6b5c890bc0d251855f61',1,'cv::FileStorage::write(FileStorage &fs, const Size_< _Tp > &sz)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a843319acfe360410e8cfcff1749aa5b0',1,'cv::FileStorage::write(FileStorage &fs, const Complex< _Tp > &c)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#abff24d9b3462a4d368e864b09c62de46',1,'cv::FileStorage::write(FileStorage &fs, const Rect_< _Tp > &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a5d8a4afcb9a84c5705605b6456f0bf4a',1,'cv::FileStorage::write(FileStorage &fs, const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#afcf3219ea83b2e466f0d9631ea53d7a3',1,'cv::FileStorage::write(FileStorage &fs, const Matx< _Tp, m, n > &x)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a54bf874d535dfc61b08fff99e7b5e8ab',1,'cv::FileStorage::write(FileStorage &fs, const Scalar_< _Tp > &s)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#acb53272996fd5a25ca077aeb5385a9a3',1,'cv::FileStorage::write(FileStorage &fs, const Range &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af710db7aa40918f5429ba8e78622d08f',1,'cv::FileStorage::write(FileStorage &fs, const std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a04c8f9337b9d9821114f951faee80bae',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a550f8a4931274589cdc5a3796c2eef48',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Point3_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a84453625335849d8ec1a0df6c865b0cb',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Size_< _Tp > &sz)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ace7fc76da8b2a634a5c83183700f0bbb',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Complex< _Tp > &c)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a43c8a8a86952cff8b062e18c9f3e72cc',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Rect_< _Tp > &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a893a9ed023837feb61f7fe804d21cb40',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae11814668aa0bf1957b8c612eaac033d',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Matx< _Tp, m, n > &x)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a6f13874950203b1bbbe4ec4fee5eb6a1',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Scalar_< _Tp > &s)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#addda29520f80f53e144a5e15b57ec98d',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const Range &r)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a1fcc9cf302523a5ab15f62f77a3bd6dd',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const KeyPoint &kpt)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa7eda7701e29ddfcba1ce21615113c67',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const DMatch &m)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ac1f774dd8fb03a6b5207e022d3553f2d',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const _Tp &val)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a6e3ddba0ac9a82d6f7817f9db1aa2556',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af9feef3fb24eb47d9a665056977d1183',1,'cv::FileStorage::write(FileStorage &fs, const String &name, const std::vector< std::vector< _Tp > > &vec)'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#af612c5c0956c84b96886214850d3a0bc',1,'cv::FlannBasedMatcher::write()'],['https://docs.opencv.org/4.2.0/da/dfe/classcv_1_1optflow_1_1GPCForest.html#a317f6d1fd8a028e47c469eb1778af9db',1,'cv::optflow::GPCForest::write()'],['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#a396150fc270fc42152219b39105f29c4',1,'cv::optflow::GPCTree::write()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a2c13c67988147921d6ba313e15de5fda',1,'cv::HOGDescriptor::write()'],['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html#ac8ec5fe840feca057df5a4f90c7bd7b4',1,'cv::linemod::Modality::write()'],['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#ad70dd357d8e4386f8c147897f966b40e',1,'cv::saliency::ObjectnessBING::write()'],['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html#afa2950e99d03759f3e2394f7a5672a98',1,'cv::TrackerMIL::Params::write()'],['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#a06f76caf3e89aaddfc540e0a6bdd9ae3',1,'cv::TrackerBoosting::Params::write()'],['https://docs.opencv.org/4.2.0/d3/dd0/structcv_1_1TrackerTLD_1_1Params.html#a485ac93be2b220d8b020dcc8d9e5e0b4',1,'cv::TrackerTLD::Params::write()'],['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a56d11b10af7e63e34c8ccff1bce443a1',1,'cv::TrackerKCF::Params::write()'],['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1TrackerGOTURN_1_1Params.html#acc89c25f05279f72695bca8bdbc1c125',1,'cv::TrackerGOTURN::Params::write()'],['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#af40d2712494f15b6b884c0c170a3dd95',1,'cv::TrackerCSRT::Params::write()'],['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#a6eb4f9a24ac568f6eb62ef17885c4490',1,'cv::TrackerMedianFlow::Params::write()'],['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#ab2873083a7433d4234500fa03674f902',1,'cv::face::FacemarkAAM::Params::write()'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#ac150e2bd3daab2c329a21d1b522b12c4',1,'cv::face::FacemarkLBF::Params::write()'],['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a0f5a3d9c595f1ebf20786fad3139a4df',1,'cv::SimpleBlobDetector::Params::write()'],['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#aaf5563228474e836b7704faa0946e30b',1,'cv::line_descriptor::BinaryDescriptor::Params::write()'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a8be99fa476731ff5429c241e9a92a57b',1,'cv::PCA::write()'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a6ca674fac252493b7f7c482fe9459d28',1,'cv::ppf_match_3d::PPF3DDetector::write()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a227be08609d12665e3677ec40f898b3a',1,'cv::ocl::Program::write()'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a92d80a2c309c46a46b22ec125cad3943',1,'cv::bioinspired::Retina::write(String fs) const=0'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#af0fb1fda44face9993785ef41b38430d',1,'cv::bioinspired::Retina::write(FileStorage &fs) const CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#a798e24c07c8632fa44c46cb00ac4bb43',1,'cv::saliency::StaticSaliencySpectralResidual::write()'],['https://docs.opencv.org/4.2.0/d2/dc7/structcv_1_1linemod_1_1Template.html#ac967858e0c0672241202f255ac6dba13',1,'cv::linemod::Template::write()'],['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a2c96f70b2791b5a9684c33382095f3dc',1,'cv::Tracker::write()'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#a15675b516e84363d664ee28fd88ace3a',1,'cv::bioinspired::TransientAreasSegmentationModule::write(String fs) const=0'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#a201d5ffa41f8eee4e98e179fa036a07a',1,'cv::bioinspired::TransientAreasSegmentationModule::write(cv::FileStorage &fs) const CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/df/dde/classcv_1_1cudacodec_1_1VideoWriter.html#a6318b8266c824bd17081940a7930b18e',1,'cv::cudacodec::VideoWriter::write()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a30ebbc09c122332f62bd706b43f02a98',1,'cv::VideoWriter::write()'],['https://docs.opencv.org/4.2.0/de/d0e/classcv_1_1xobjdetect_1_1WBDetector.html#a7d85338895707904ae1ddb4374ec8dac',1,'cv::xobjdetect::WBDetector::write()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'basic_iostream< char >::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'basic_iostream< char >::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'basic_ostream< char >::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'basic_ostream< char >::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'basic_ostream< char, _Traits >::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'basic_ostream< char, _Traits >::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_fstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_fstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_iostream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_iostream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_ofstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_ofstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_ostream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_ostream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_ostringstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_ostringstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_stringstream::write(const char_type *__s, streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0c642eb4a583616126b1f45cab2c2f0f',1,'std::basic_stringstream::write(const char_type *__s, streamsize __n)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a027b764f14e54f8838b5120e991bd29c',1,'cv::write()'],['../group__camera.html#ga806482a95ece6e635dc2adea22008df5',1,'cam::write()']]], + ['write_5fbase64_267',['WRITE_BASE64',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da74cdcbdb96c29f19e3ccc2ba4ab81614',1,'cv::FileStorage']]], + ['write_5fcombined_268',['WRITE_COMBINED',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#aa0d69b2aa95680a6b2af6dc4dda44e16aef6b60397f05650d972d2cf55e3523eb',1,'cv::cuda::HostMem']]], + ['write_5fonly_269',['WRITE_ONLY',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a6b2a295dc840db8b6728db2f3a439d6eadca1f60cf44ecc42163b5f03318abb77',1,'cv::ogl::Buffer::WRITE_ONLY'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a1010adb068498c191b8079323ad790f9a7e7f7fcb59366af118874fb12865b52f',1,'cv::ocl::KernelArg::WRITE_ONLY']]], + ['writeaccessors_270',['WriteAccessors',['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5dabcadf08230fb1a5ef7b3195745d3a458',1,'Eigen::WriteAccessors'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5dabcadf08230fb1a5ef7b3195745d3a458',1,'WriteAccessors(Global Namespace)']]], + ['writeback_271',['writeBack',['https://docs.opencv.org/4.2.0/d2/d64/structcv_1_1detail_1_1scalar__wrapper.html#a6877f0aae02d7c07cce92951448fc488',1,'cv::detail::scalar_wrapper::writeBack()'],['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1detail_1_1scalar__wrapper__ocl.html#a9b6af8605efab7ff381ebd1f69ac2ea3',1,'cv::detail::scalar_wrapper_ocl::writeBack()']]], + ['writebinaryfile_272',['writeBinaryfile',['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html#a41a5eafba66fe2677d079ff157f19594',1,'cv::cnn_3dobj::icoSphere']]], + ['writeclass_273',['writeClass',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a150685aaacdd5e6b99361fdd72baac3d',1,'cv::linemod::Detector']]], + ['writeclasses_274',['writeClasses',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a5113da474bbd6558cff732dadc576c87',1,'cv::linemod::Detector']]], + ['writecloud_275',['writeCloud',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac2afffcdc8346762a0979664e9e2b249',1,'cv::viz::writeCloud()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac2afffcdc8346762a0979664e9e2b249',1,'writeCloud()(Global Namespace)']]], + ['writecomment_276',['writeComment',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a143eb62cf2c063095c005c0ac77a8823',1,'cv::FileStorage']]], + ['writefeature_277',['writeFeature',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#ac6e562852e9abb1fdada6114b20fa4fc',1,'cv::CvHaarEvaluator']]], + ['writefeatures_278',['writeFeatures',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a0b56b5cdb99ade4f0f2429875a529720',1,'cv::CvFeatureEvaluator::writeFeatures()'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a9b43b2bec3bdbbeebeb72dbff07c637b',1,'cv::CvHaarEvaluator::writeFeatures()'],['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#a32cf9ad66944e2052f3a958427348a9c',1,'cv::CvHOGEvaluator::writeFeatures()'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#a93592dff69ebefd2072335da62f170e2',1,'cv::CvLBPEvaluator::writeFeatures()']]], + ['writeformat_279',['writeFormat',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a68eeca71617474ad3d4561786f0289d2',1,'cv::Algorithm']]], + ['writeindex_280',['writeIndex',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#acb11de052da45de7be8d802c6b2b9d7a',1,'cv::AVIWriteContainer']]], + ['writelogmessage_281',['writeLogMessage',['https://docs.opencv.org/4.2.0/d9/dd4/namespacecv_1_1utils_1_1logging_1_1internal.html#acf0166b1abacd898a77f46d785ddef26',1,'cv::utils::logging::internal']]], + ['writelogmessageex_282',['writeLogMessageEx',['https://docs.opencv.org/4.2.0/d9/dd4/namespacecv_1_1utils_1_1logging_1_1internal.html#af91b3fd05f3ec7839d95a21617467628',1,'cv::utils::logging::internal']]], + ['writeonly_283',['WriteOnly',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#afb748ac6d3d227ab05d49a39b5d66726',1,'cv::ocl::KernelArg']]], + ['writeonlynosize_284',['WriteOnlyNoSize',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#ab9acb7ed46efc0b35330082fe3015f13',1,'cv::ocl::KernelArg']]], + ['writeopticalflow_285',['writeOpticalFlow',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gad6e34461a92d7716d581567e8b06a550',1,'cv::writeOpticalFlow()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gad6e34461a92d7716d581567e8b06a550',1,'writeOpticalFlow()(Global Namespace)']]], + ['writeparameters_286',['writeParameters',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#a02695657ee01e5a5aa5746000816f050',1,'cv::multicalib::MultiCameraCalibration']]], + ['writeply_287',['writePLY',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga72ffa4c73f214a573cb4028e015c4adb',1,'cv::ppf_match_3d::writePLY()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga72ffa4c73f214a573cb4028e015c4adb',1,'writePLY()(Global Namespace)']]], + ['writeplyvisiblenormals_288',['writePLYVisibleNormals',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga965333522cfe06814478dec8ffa4cd41',1,'cv::ppf_match_3d::writePLYVisibleNormals()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga965333522cfe06814478dec8ffa4cd41',1,'writePLYVisibleNormals()(Global Namespace)']]], + ['writepose_289',['writePose',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a862206978d42ff33da0b73467c8c639f',1,'cv::ppf_match_3d::Pose3D::writePose(FILE *f)'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a89cec144db41d73c638feed401128f3f',1,'cv::ppf_match_3d::Pose3D::writePose(const std::string &FileName)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga3d25aaecb4a692f446179fed36eeb1b4',1,'cv::viz::writePose()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga3d25aaecb4a692f446179fed36eeb1b4',1,'writePose()(Global Namespace)']]], + ['writeposecluster_290',['writePoseCluster',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a022b8e9e02a92a5303690ca8cc001acd',1,'cv::ppf_match_3d::PoseCluster3D::writePoseCluster(FILE *f)'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a7557d1bb33423b90f9bbf7e2be47aece',1,'cv::ppf_match_3d::PoseCluster3D::writePoseCluster(const std::string &FileName)']]], + ['writer_291',['writer',['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a8d73b66ca5bc85ec071052ed7f417b5f',1,'cv::VideoWriter']]], + ['writeraw_292',['writeRaw',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a513583eecda2e5e3c3b26e328448c123',1,'cv::FileStorage']]], + ['writescalar_293',['writeScalar',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae8c1ed7775a9692dd5a04e7b9c257332',1,'cv::FileStorage::writeScalar(FileStorage &fs, int value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ad3dab4054c2a10a45238fd10d11f280e',1,'cv::FileStorage::writeScalar(FileStorage &fs, float value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ac4ec3e0ff8321cd7a2b312e275d1b7ba',1,'cv::FileStorage::writeScalar(FileStorage &fs, double value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a2a8da1ead8d174f9244b5e8593ebd1d8',1,'cv::FileStorage::writeScalar(FileStorage &fs, const String &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae8c1ed7775a9692dd5a04e7b9c257332',1,'cv::FileStorage::writeScalar(FileStorage &fs, int value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ad3dab4054c2a10a45238fd10d11f280e',1,'cv::FileStorage::writeScalar(FileStorage &fs, float value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ac4ec3e0ff8321cd7a2b312e275d1b7ba',1,'cv::FileStorage::writeScalar(FileStorage &fs, double value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a2a8da1ead8d174f9244b5e8593ebd1d8',1,'cv::FileStorage::writeScalar(FileStorage &fs, const String &value)']]], + ['writestreamheader_294',['writeStreamHeader',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a1dfee94302648b5020638320f20108a4',1,'cv::AVIWriteContainer']]], + ['writetextgraph_295',['writeTextGraph',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga0c3f216f5f858efdef44b68636133dff',1,'cv::dnn::writeTextGraph()'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga0c3f216f5f858efdef44b68636133dff',1,'writeTextGraph()(Global Namespace)']]], + ['writetofilestorage_296',['writeToFileStorage',['../classcam_1_1CameraParams.html#a2b2311039851a446ad081f6532bc6c15',1,'cam::CameraParams']]], + ['writetrajectory_297',['writeTrajectory',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga62f87da85e4c2cc315918beb449bd706',1,'cv::viz::writeTrajectory()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga62f87da85e4c2cc315918beb449bd706',1,'writeTrajectory(InputArray traj, const String &files_format="pose%05d.xml", int start=0, const String &tag="pose")(Global Namespace)']]], + ['writing_298',['Image file reading and writing',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html',1,'']]], + ['writing_20and_20reading_20datasets_299',['Creating, Writing and Reading Datasets',['https://docs.opencv.org/4.2.0/d4/d93/tutorial_hdf_create_read_write_datasets.html',1,'']]], + ['writing_20attributes_300',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]], + ['writing_20documentation_20for_20opencv_301',['Writing documentation for OpenCV',['https://docs.opencv.org/4.2.0/d4/db1/tutorial_documentation.html',1,'']]], + ['writing_20efficient_20matrix_20product_20expressions_302',['Writing efficient matrix product expressions',['https://eigen.tuxfamily.org/dox/TopicWritingEfficientProductExpression.html',1,'']]], + ['writing_20functions_20taking_20eigen_20types_20as_20parameters_303',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], + ['written_20data_20using_20knn_304',['OCR of Hand-written Data using kNN',['https://docs.opencv.org/4.2.0/d8/d4b/tutorial_py_knn_opencv.html',1,'']]], + ['written_20data_20using_20svm_305',['OCR of Hand-written Data using SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'']]], + ['wrong_20assumption_20on_20stack_20alignment_306',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], + ['wrong_5fobject_307',['WRONG_OBJECT',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ad43563cc5b954817ad5078f995afd3ffaf4b74b622d1802cbb6573c8b1148c953',1,'cv::DetectionBasedTracker']]], + ['ws_308',['ws',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad864c3d25c6f09088c3a6e8d22151a5d',1,'std']]], + ['wscale_309',['wscale',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#aafa6d7b275138dd568afb41a388c2fc4',1,'cv::ocl::KernelArg']]], + ['wsphere_310',['WSphere',['https://docs.opencv.org/4.2.0/d1/da7/classcv_1_1viz_1_1WSphere.html',1,'cv::viz::WSphere'],['https://docs.opencv.org/4.2.0/d1/da7/classcv_1_1viz_1_1WSphere.html#ac9d7e5ab6678319eb3194fcc5a3f727a',1,'cv::viz::WSphere::WSphere()']]], + ['wsregex_5ftoken_5fiterator_311',['wsregex_token_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga45d6a7c3f216b9e231d6bfbe2f405821',1,'std::wsregex_token_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga45d6a7c3f216b9e231d6bfbe2f405821',1,'wsregex_token_iterator(Global Namespace)']]], + ['wssub_5fmatch_312',['wssub_match',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga093a1ad2914d74a3fafb7baa78a3deb6',1,'std::wssub_match'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga093a1ad2914d74a3fafb7baa78a3deb6',1,'wssub_match(Global Namespace)']]], + ['wstreambuf_313',['wstreambuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga72040b852b537e306ce9c862698e0e07',1,'std::wstreambuf'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga72040b852b537e306ce9c862698e0e07',1,'wstreambuf(Global Namespace)']]], + ['wstreampos_314',['wstreampos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4c451a38ccf44b2ce7d8aadf02bb6309',1,'std']]], + ['wstring_315',['wstring',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01516.html#gacc5a707e71ec50089cb9f653282f22f7',1,'std::wstring'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01516.html#gacc5a707e71ec50089cb9f653282f22f7',1,'wstring(Global Namespace)']]], + ['wstring_5fconvert_316',['wstring_convert',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html',1,'std::wstring_convert< class, class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a26644c46ef7342d3536fc89f0f905cb5',1,'std::wstring_convert::wstring_convert()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a1db78585f8e05fe4515a96d668379bb5',1,'std::wstring_convert::wstring_convert(_Codecvt *__pcvt)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#ac63cbe7aac1dc89a72e1e40134545d41',1,'std::wstring_convert::wstring_convert(_Codecvt *__pcvt, state_type __state)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#aa7882cf7b53baff7d6d2cf9ca3386b3a',1,'std::wstring_convert::wstring_convert(const byte_string &__byte_err, const wide_string &__wide_err=wide_string())']]], + ['wstringbuf_317',['wstringbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga4e78c6817168947842caf24c3ffd5352',1,'std::wstringbuf'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#ga4e78c6817168947842caf24c3ffd5352',1,'wstringbuf(Global Namespace)']]], + ['wstringstream_318',['wstringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gabd6a5fd8237370934ed97cc2e77b7021',1,'std::wstringstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gabd6a5fd8237370934ed97cc2e77b7021',1,'wstringstream(Global Namespace)']]], + ['wtext_319',['WText',['https://docs.opencv.org/4.2.0/de/d0b/classcv_1_1viz_1_1WText.html',1,'cv::viz::WText'],['https://docs.opencv.org/4.2.0/de/d0b/classcv_1_1viz_1_1WText.html#af98383ae4571f39563c0ce8afdf41053',1,'cv::viz::WText::WText()']]], + ['wtext3d_320',['WText3D',['https://docs.opencv.org/4.2.0/d6/d3d/classcv_1_1viz_1_1WText3D.html',1,'cv::viz::WText3D'],['https://docs.opencv.org/4.2.0/d6/d3d/classcv_1_1viz_1_1WText3D.html#a88a78943e58fa5726482a96b21e2dba0',1,'cv::viz::WText3D::WText3D()']]], + ['wtrajectory_321',['WTrajectory',['https://docs.opencv.org/4.2.0/d0/da3/classcv_1_1viz_1_1WTrajectory.html',1,'cv::viz::WTrajectory'],['https://docs.opencv.org/4.2.0/d0/da3/classcv_1_1viz_1_1WTrajectory.html#adea00ca972dff63b1dcf06fcfe65b02c',1,'cv::viz::WTrajectory::WTrajectory()']]], + ['wtrajectoryfrustums_322',['WTrajectoryFrustums',['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1viz_1_1WTrajectoryFrustums.html',1,'cv::viz::WTrajectoryFrustums'],['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1viz_1_1WTrajectoryFrustums.html#a584bdf50379fd90dd3775e33b275152a',1,'cv::viz::WTrajectoryFrustums::WTrajectoryFrustums(InputArray path, const Matx33d &K, double scale=1., const Color &color=Color::white())'],['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1viz_1_1WTrajectoryFrustums.html#a5dd5e11a871978843a726de1f82f69ff',1,'cv::viz::WTrajectoryFrustums::WTrajectoryFrustums(InputArray path, const Vec2d &fov, double scale=1., const Color &color=Color::white())']]], + ['wtrajectoryspheres_323',['WTrajectorySpheres',['https://docs.opencv.org/4.2.0/d4/dca/classcv_1_1viz_1_1WTrajectorySpheres.html',1,'cv::viz::WTrajectorySpheres'],['https://docs.opencv.org/4.2.0/d4/dca/classcv_1_1viz_1_1WTrajectorySpheres.html#ac41ba95b84ce2883a4e647bb79db27d4',1,'cv::viz::WTrajectorySpheres::WTrajectorySpheres()']]], + ['wwidgetmerger_324',['WWidgetMerger',['https://docs.opencv.org/4.2.0/df/d97/classcv_1_1viz_1_1WWidgetMerger.html',1,'cv::viz::WWidgetMerger'],['https://docs.opencv.org/4.2.0/df/d97/classcv_1_1viz_1_1WWidgetMerger.html#abb0dfc2f9877faae37f53eb61beb58e2',1,'cv::viz::WWidgetMerger::WWidgetMerger()']]], + ['wx_325',['Wx',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#a5db659a99ea517f666e0d75e261ad4b5',1,'cv::datasets::join']]], + ['wy_326',['Wy',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#aed76f4f61e9c07356e87c9614211565d',1,'cv::datasets::join']]], + ['wz_327',['Wz',['https://docs.opencv.org/4.2.0/d0/de2/structcv_1_1datasets_1_1join.html#a64fa0cf136bece7c7c10dac726c2acc0',1,'cv::datasets::join']]] ]; diff --git a/search/all_24.js b/search/all_24.js index 5ac70342..7d397536 100644 --- a/search/all_24.js +++ b/search/all_24.js @@ -134,8 +134,8 @@ var searchData= ['_7elist_131',['~list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a6520eeff66a82d7b6e5eacffdcb2da6e',1,'list< __inp, __rebind_inp >::~list()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a6520eeff66a82d7b6e5eacffdcb2da6e',1,'std::list::~list()']]], ['_7elocale_132',['~locale',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a45b12cb443002d7995d5a1fd4d2ad179',1,'std::locale']]], ['_7elock_5fguard_133',['~lock_guard',['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1utils_1_1lock__guard.html#afb8ed8974c3f3a9fd2ac3e092619c17d',1,'cv::utils::lock_guard']]], - ['_7emap_134',['~map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a2460e7e43dc674a1cb696c4eb1985b5e',1,'std::map']]], - ['_7emap_135',['~Map',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html#afaab55825ddfaf5a44de8d8ae69d92e8',1,'cv::reg::Map::~Map()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01SparseMatrixType_01_4.html#aefb5ce85ff8508d6a035b1b72158ca83',1,'Eigen::Map< SparseMatrixType >::~Map()']]], + ['_7emap_134',['~Map',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html#afaab55825ddfaf5a44de8d8ae69d92e8',1,'cv::reg::Map::~Map()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01SparseMatrixType_01_4.html#aefb5ce85ff8508d6a035b1b72158ca83',1,'Eigen::Map< SparseMatrixType >::~Map()']]], + ['_7emap_135',['~map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a2460e7e43dc674a1cb696c4eb1985b5e',1,'std::map']]], ['_7emapaffine_136',['~MapAffine',['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#ab62885a2fcb44dbd54cc11bf29f6b5ff',1,'cv::reg::MapAffine']]], ['_7emappedsparsematrix_137',['~MappedSparseMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1MappedSparseMatrix.html#a0c36a53853f1659ea59447bcb9a20799',1,'Eigen::MappedSparseMatrix::~MappedSparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MappedSparseMatrix.html#a0c36a53853f1659ea59447bcb9a20799',1,'MappedSparseMatrix< Scalar, ColMajor, StorageIndex >::~MappedSparseMatrix()']]], ['_7emapper_138',['~Mapper',['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1reg_1_1Mapper.html#a81420438917d1adeb2395083a087c7bb',1,'cv::reg::Mapper']]], diff --git a/search/all_9.js b/search/all_9.js index 9b82a127..4fc9717a 100644 --- a/search/all_9.js +++ b/search/all_9.js @@ -631,147 +631,146 @@ var searchData= ['_5fqualitymse_628',['_qualityMSE',['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#a9d7cca3ac25fef0eaa8ae3d0326ff6fc',1,'cv::quality::QualityPSNR']]], ['_5fquoted_5fstring_629',['_Quoted_string',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06327.html',1,'std::__detail']]], ['_5frandomnumber_630',['_RandomNumber',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09671.html',1,'__gnu_parallel::_RandomNumber'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09671.html#acdf323e8c00b83892d86bf932bf3a966',1,'__gnu_parallel::_RandomNumber::_RandomNumber()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09671.html#ae80e68e8fce17ae590fd4ca1b5ea40d4',1,'__gnu_parallel::_RandomNumber::_RandomNumber(uint32_t __seed, uint64_t _M_supremum=0x100000000ULL)']]], - ['_5frange_631',['_Range',['https://docs.opencv.org/4.2.0/d9/ddc/structcv_1_1dnn_1_1__Range.html',1,'cv::dnn']]], + ['_5frange_631',['_Range',['https://docs.opencv.org/4.2.0/d9/ddc/structcv_1_1dnn_1_1__Range.html',1,'cv::dnn::_Range'],['https://docs.opencv.org/4.2.0/d9/ddc/structcv_1_1dnn_1_1__Range.html#a2dec67e4158488e2351fc1e9d3eab7ca',1,'cv::dnn::_Range::_Range(const Range &r)'],['https://docs.opencv.org/4.2.0/d9/ddc/structcv_1_1dnn_1_1__Range.html#a5339946e5ddf17692f62956c28cbe623',1,'cv::dnn::_Range::_Range(int start_, int size_=1)']]], ['_5frange_632',['_range',['https://docs.opencv.org/4.2.0/d8/d99/classcv_1_1quality_1_1QualityBRISQUE.html#ac34460b2bc579d1c6e98646e4ad5e590',1,'cv::quality::QualityBRISQUE']]], - ['_5frange_633',['_Range',['https://docs.opencv.org/4.2.0/d9/ddc/structcv_1_1dnn_1_1__Range.html#a2dec67e4158488e2351fc1e9d3eab7ca',1,'cv::dnn::_Range::_Range(const Range &r)'],['https://docs.opencv.org/4.2.0/d9/ddc/structcv_1_1dnn_1_1__Range.html#a5339946e5ddf17692f62956c28cbe623',1,'cv::dnn::_Range::_Range(int start_, int size_=1)']]], - ['_5fref_634',['_ref',['https://docs.opencv.org/4.2.0/d7/d80/classcv_1_1quality_1_1QualityMSE.html#ac63637fb1fb813c36dd9dbd0a4a50797',1,'cv::quality::QualityMSE']]], - ['_5freference_5fwrapper_5fbase_635',['_Reference_wrapper_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06695.html',1,'std']]], - ['_5freference_5fwrapper_5fbase_3c_20remove_5fcv_3c_20_5ftp_20_3e_3a_3atype_20_3e_636',['_Reference_wrapper_base< remove_cv< _Tp >::type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06695.html',1,'']]], - ['_5frefimgdata_637',['_refImgData',['https://docs.opencv.org/4.2.0/d8/d81/classcv_1_1quality_1_1QualityGMSD.html#acb7c1766c0dea9c59f0b363a54e650ac',1,'cv::quality::QualityGMSD::_refImgData'],['https://docs.opencv.org/4.2.0/d9/db5/classcv_1_1quality_1_1QualitySSIM.html#a6ecb65c443c7f7ae202d9636b4e26e7e',1,'cv::quality::QualitySSIM::_refImgData']]], - ['_5frehash_5fbase_638',['_Rehash_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05759.html',1,'std::__detail']]], - ['_5frehash_5fbase_3c_20_5fkey_2c_20_5fvalue_2c_20_5falloc_2c_20_5fextractkey_2c_20_5fequal_2c_20_5fh1_2c_20_5fh2_2c_20_5fhash_2c_20_5frehashpolicy_2c_20_5ftraits_20_3e_639',['_Rehash_base< _Key, _Value, _Alloc, _ExtractKey, _Equal, _H1, _H2, _Hash, _RehashPolicy, _Traits >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05759.html',1,'']]], - ['_5frehash_5fbase_3c_20_5fkey_2c_20_5fvalue_2c_20_5falloc_2c_20_5fextractkey_2c_20_5fequal_2c_20_5fh1_2c_20_5fh2_2c_20_5fhash_2c_20_5frehashpolicy_2c_20_5ftraits_2c_20std_3a_3afalse_5ftype_20_3e_640',['_Rehash_base< _Key, _Value, _Alloc, _ExtractKey, _Equal, _H1, _H2, _Hash, _RehashPolicy, _Traits, std::false_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05763.html',1,'std::__detail']]], - ['_5frehash_5fbase_3c_20_5fkey_2c_20_5fvalue_2c_20_5falloc_2c_20_5fextractkey_2c_20_5fequal_2c_20_5fh1_2c_20_5fh2_2c_20_5fhash_2c_20_5frehashpolicy_2c_20_5ftraits_2c_20std_3a_3atrue_5ftype_20_3e_641',['_Rehash_base< _Key, _Value, _Alloc, _ExtractKey, _Equal, _H1, _H2, _Hash, _RehashPolicy, _Traits, std::true_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05767.html',1,'std::__detail']]], - ['_5frelative_5fpointer_5fimpl_642',['_Relative_pointer_impl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10543.html',1,'__gnu_cxx']]], - ['_5frelative_5fpointer_5fimpl_3c_20const_20_5ftp_20_3e_643',['_Relative_pointer_impl< const _Tp >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10547.html',1,'__gnu_cxx']]], - ['_5fresize_5fto_5fmatch_644',['_resize_to_match',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'Eigen::PlainObjectBase::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()']]], - ['_5frestrictedboundedconcurrentqueue_645',['_RestrictedBoundedConcurrentQueue',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html',1,'__gnu_parallel::_RestrictedBoundedConcurrentQueue< _Tp >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#a7070da9f66983a3fa24ae4dc92614c0c',1,'__gnu_parallel::_RestrictedBoundedConcurrentQueue::_RestrictedBoundedConcurrentQueue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#a7070da9f66983a3fa24ae4dc92614c0c',1,'_RestrictedBoundedConcurrentQueue< pair< _RAIter, _RAIter > >::_RestrictedBoundedConcurrentQueue()']]], - ['_5frestrictedboundedconcurrentqueue_3c_20pair_3c_20_5fraiter_2c_20_5fraiter_20_3e_20_3e_646',['_RestrictedBoundedConcurrentQueue< pair< _RAIter, _RAIter > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html',1,'']]], - ['_5frestrictedboundedconcurrentqueue_3c_20std_3a_3apair_20_3e_647',['_RestrictedBoundedConcurrentQueue< std::pair >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html',1,'__gnu_parallel']]], - ['_5fresult_648',['_Result',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02267.html',1,'std::__future_base']]], - ['_5fresult_3c_20_5fres_20_26_20_3e_649',['_Result< _Res & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02327.html',1,'std::__future_base']]], - ['_5fresult_3c_20void_20_3e_650',['_Result< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02331.html',1,'std::__future_base']]], - ['_5fresult_5falloc_651',['_Result_alloc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02271.html',1,'std::__future_base']]], - ['_5fresult_5fbase_652',['_Result_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02259.html',1,'std::__future_base']]], - ['_5fs_653',['_s',['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a679c37671185a138e48bb4ab491afa3f',1,'cv::ClfOnlineStump']]], - ['_5fs_5fconstant_654',['_S_constant',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#aecb3969b2c41415a01b68e6d8130538d',1,'__gnu_debug::_Safe_iterator::_S_constant()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a65378aa3baca9f98cbc4bf7e0049a8c8',1,'__gnu_debug::_Safe_local_iterator::_S_constant()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#aecb3969b2c41415a01b68e6d8130538d',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::_S_constant()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#aecb3969b2c41415a01b68e6d8130538d',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::_S_constant()']]], - ['_5fsafe_5fcontainer_655',['_Safe_container',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'__gnu_debug']]], - ['_5fsafe_5fcontainer_3c_20basic_5fstring_3c_20_5fchart_2c_20_5ftraits_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5fsafe_5fsequence_2c_20bool_28_5fglibcxx_5fuse_5fcxx11_5fabi_29_3e_656',['_Safe_container< basic_string< _CharT, _Traits, _Allocator >, _Allocator, _Safe_sequence, bool(_GLIBCXX_USE_CXX11_ABI)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fcontainer_3c_20deque_3c_20_5ftp_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fsequence_20_3e_657',['_Safe_container< deque< _Tp, _Allocator >, _Allocator, __gnu_debug::_Safe_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fcontainer_3c_20forward_5flist_3c_20_5ftp_2c_20_5falloc_20_3e_2c_20_5falloc_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fforward_5flist_20_3e_658',['_Safe_container< forward_list< _Tp, _Alloc >, _Alloc, __gnu_debug::_Safe_forward_list >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fcontainer_3c_20list_3c_20_5ftp_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fnode_5fsequence_20_3e_659',['_Safe_container< list< _Tp, _Allocator >, _Allocator, __gnu_debug::_Safe_node_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fcontainer_3c_20map_3c_20_5fkey_2c_20_5ftp_2c_20_5fcompare_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fnode_5fsequence_20_3e_660',['_Safe_container< map< _Key, _Tp, _Compare, _Allocator >, _Allocator, __gnu_debug::_Safe_node_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fcontainer_3c_20multimap_3c_20_5fkey_2c_20_5ftp_2c_20_5fcompare_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fnode_5fsequence_20_3e_661',['_Safe_container< multimap< _Key, _Tp, _Compare, _Allocator >, _Allocator, __gnu_debug::_Safe_node_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fcontainer_3c_20multiset_3c_20_5fkey_2c_20_5fcompare_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fnode_5fsequence_20_3e_662',['_Safe_container< multiset< _Key, _Compare, _Allocator >, _Allocator, __gnu_debug::_Safe_node_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fcontainer_3c_20set_3c_20_5fkey_2c_20_5fcompare_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fnode_5fsequence_20_3e_663',['_Safe_container< set< _Key, _Compare, _Allocator >, _Allocator, __gnu_debug::_Safe_node_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fcontainer_3c_20unordered_5fmap_3c_20_5fkey_2c_20_5ftp_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_2c_20_5falloc_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5funordered_5fcontainer_20_3e_664',['_Safe_container< unordered_map< _Key, _Tp, _Hash, _Pred, _Alloc >, _Alloc, __gnu_debug::_Safe_unordered_container >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fcontainer_3c_20unordered_5fmultimap_3c_20_5fkey_2c_20_5ftp_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_2c_20_5falloc_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5funordered_5fcontainer_20_3e_665',['_Safe_container< unordered_multimap< _Key, _Tp, _Hash, _Pred, _Alloc >, _Alloc, __gnu_debug::_Safe_unordered_container >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fcontainer_3c_20unordered_5fmultiset_3c_20_5fvalue_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_2c_20_5falloc_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5funordered_5fcontainer_20_3e_666',['_Safe_container< unordered_multiset< _Value, _Hash, _Pred, _Alloc >, _Alloc, __gnu_debug::_Safe_unordered_container >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fcontainer_3c_20unordered_5fset_3c_20_5fvalue_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_2c_20_5falloc_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5funordered_5fcontainer_20_3e_667',['_Safe_container< unordered_set< _Value, _Hash, _Pred, _Alloc >, _Alloc, __gnu_debug::_Safe_unordered_container >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fcontainer_3c_20vector_3c_20_5ftp_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fsequence_20_3e_668',['_Safe_container< vector< _Tp, _Allocator >, _Allocator, __gnu_debug::_Safe_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], - ['_5fsafe_5fforward_5flist_669',['_Safe_forward_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08847.html',1,'__gnu_debug']]], - ['_5fsafe_5fforward_5flist_3c_20forward_5flist_3c_20_5ftp_2c_20_5falloc_20_3e_20_3e_670',['_Safe_forward_list< forward_list< _Tp, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08847.html',1,'']]], - ['_5fsafe_5fiterator_671',['_Safe_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html',1,'__gnu_debug::_Safe_iterator< _Iterator, _Sequence, _Category >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#aafbf4eeec97f82fe9ef786e2e1b8cebf',1,'__gnu_debug::_Safe_iterator::_Safe_iterator() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#abf10f26b438e7b11af47be15ec965f33',1,'__gnu_debug::_Safe_iterator::_Safe_iterator(_Iterator __i, const _Safe_sequence_base *__seq) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a12cb2be26e6bd1c50970282d47a15a54',1,'__gnu_debug::_Safe_iterator::_Safe_iterator(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a14fc079f9d52ed25624839bf56d6e0bb',1,'__gnu_debug::_Safe_iterator::_Safe_iterator(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a6e50cd4b55f01b8c305e501bde8f8c2f',1,'__gnu_debug::_Safe_iterator::_Safe_iterator(const _Safe_iterator< _MutableIterator, _Sequence, typename __gnu_cxx::__enable_if< _IsConstant::__value &&std::__are_same< _MutableIterator, _OtherIterator >::__value, _Category >::__type > &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#aafbf4eeec97f82fe9ef786e2e1b8cebf',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::_Safe_iterator() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#abf10f26b438e7b11af47be15ec965f33',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::_Safe_iterator(_Iterator __i, const _Safe_sequence_base *__seq) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a12cb2be26e6bd1c50970282d47a15a54',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::_Safe_iterator(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a14fc079f9d52ed25624839bf56d6e0bb',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::_Safe_iterator(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a6e50cd4b55f01b8c305e501bde8f8c2f',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::_Safe_iterator(const _Safe_iterator< _MutableIterator, _Sequence, typename __gnu_cxx::__enable_if< _IsConstant::__value &&std::__are_same< _MutableIterator, _OtherIterator >::__value, std::bidirectional_iterator_tag >::__type > &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#aafbf4eeec97f82fe9ef786e2e1b8cebf',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::_Safe_iterator() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#abf10f26b438e7b11af47be15ec965f33',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::_Safe_iterator(_Iterator __i, const _Safe_sequence_base *__seq) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a12cb2be26e6bd1c50970282d47a15a54',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::_Safe_iterator(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a14fc079f9d52ed25624839bf56d6e0bb',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::_Safe_iterator(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a6e50cd4b55f01b8c305e501bde8f8c2f',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::_Safe_iterator(const _Safe_iterator< _MutableIterator, _Sequence, typename __gnu_cxx::__enable_if< _IsConstant::__value &&std::__are_same< _MutableIterator, _OtherIterator >::__value, std::forward_iterator_tag >::__type > &__x) noexcept']]], - ['_5fsafe_5fiterator_3c_20_5fiterator_2c_20_5fsequence_2c_20std_3a_3abidirectional_5fiterator_5ftag_20_3e_672',['_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html',1,'']]], - ['_5fsafe_5fiterator_3c_20_5fiterator_2c_20_5fsequence_2c_20std_3a_3aforward_5fiterator_5ftag_20_3e_673',['_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html',1,'']]], - ['_5fsafe_5fiterator_5fbase_674',['_Safe_iterator_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08739.html',1,'__gnu_debug::_Safe_iterator_base'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08739.html#a3e6e1cb37b5585e5ee3b254bbd7d5cbb',1,'__gnu_debug::_Safe_iterator_base::_Safe_iterator_base()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08739.html#a74a667bf14e3feb71571c352430fcf12',1,'__gnu_debug::_Safe_iterator_base::_Safe_iterator_base(const _Safe_sequence_base *__seq, bool __constant)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08739.html#a0993fe5b5c385572b6261e2100f01191',1,'__gnu_debug::_Safe_iterator_base::_Safe_iterator_base(const _Safe_iterator_base &__x, bool __constant)']]], - ['_5fsafe_5flocal_5fiterator_675',['_Safe_local_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html',1,'__gnu_debug::_Safe_local_iterator< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#adc916fc873a967e3c62525fb890de36b',1,'__gnu_debug::_Safe_local_iterator::_Safe_local_iterator() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a380abe1aa1ff4af91374084189f86ed0',1,'__gnu_debug::_Safe_local_iterator::_Safe_local_iterator(_Iterator __i, const _Safe_sequence_base *__cont)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a0a7e70d70fe6ebf02a59eb4ed6704642',1,'__gnu_debug::_Safe_local_iterator::_Safe_local_iterator(const _Safe_local_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a281a8ffa72a96b7599ad892efc6f4367',1,'__gnu_debug::_Safe_local_iterator::_Safe_local_iterator(_Safe_local_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#ab45913e372960af8e21c2e246563e815',1,'__gnu_debug::_Safe_local_iterator::_Safe_local_iterator(const _Safe_local_iterator< _MutableIterator, typename __gnu_cxx::__enable_if< _IsConstant::__value &&std::__are_same< _MutableIterator, _OtherIterator >::__value, _Sequence >::__type > &__x) noexcept']]], - ['_5fsafe_5flocal_5fiterator_5fbase_676',['_Safe_local_iterator_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08791.html',1,'__gnu_debug::_Safe_local_iterator_base'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08791.html#ad7d51ed8396149f6d4d44e9bbf48ddf3',1,'__gnu_debug::_Safe_local_iterator_base::_Safe_local_iterator_base()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08791.html#a7958bccd20b93cf3f6cffc4ed922346d',1,'__gnu_debug::_Safe_local_iterator_base::_Safe_local_iterator_base(const _Safe_sequence_base *__seq, bool __constant)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08791.html#aba66dde2adb286395bcb7714f32e64d9',1,'__gnu_debug::_Safe_local_iterator_base::_Safe_local_iterator_base(const _Safe_local_iterator_base &__x, bool __constant)']]], - ['_5fsafe_5fnode_5fsequence_677',['_Safe_node_sequence',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08787.html',1,'__gnu_debug']]], - ['_5fsafe_5fnode_5fsequence_3c_20list_3c_20_5ftp_2c_20_5fallocator_20_3e_20_3e_678',['_Safe_node_sequence< list< _Tp, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08787.html',1,'']]], - ['_5fsafe_5fnode_5fsequence_3c_20map_3c_20_5fkey_2c_20_5ftp_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_679',['_Safe_node_sequence< map< _Key, _Tp, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08787.html',1,'']]], - ['_5fsafe_5fnode_5fsequence_3c_20multimap_3c_20_5fkey_2c_20_5ftp_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_680',['_Safe_node_sequence< multimap< _Key, _Tp, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08787.html',1,'']]], - ['_5fsafe_5fnode_5fsequence_3c_20multiset_3c_20_5fkey_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_681',['_Safe_node_sequence< multiset< _Key, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08787.html',1,'']]], - ['_5fsafe_5fnode_5fsequence_3c_20set_3c_20_5fkey_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_682',['_Safe_node_sequence< set< _Key, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08787.html',1,'']]], - ['_5fsafe_5fsequence_683',['_Safe_sequence',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'__gnu_debug']]], - ['_5fsafe_5fsequence_3c_20_5fsafesequence_20_3e_684',['_Safe_sequence< _SafeSequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], - ['_5fsafe_5fsequence_3c_20basic_5fstring_3c_20_5fchart_2c_20_5ftraits_2c_20_5fallocator_20_3e_20_3e_685',['_Safe_sequence< basic_string< _CharT, _Traits, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], - ['_5fsafe_5fsequence_3c_20deque_3c_20_5ftp_2c_20_5fallocator_20_3e_20_3e_686',['_Safe_sequence< deque< _Tp, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], - ['_5fsafe_5fsequence_3c_20forward_5flist_3c_20_5ftp_2c_20_5falloc_20_3e_20_3e_687',['_Safe_sequence< forward_list< _Tp, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], - ['_5fsafe_5fsequence_3c_20list_3c_20_5ftp_2c_20_5fallocator_20_3e_20_3e_688',['_Safe_sequence< list< _Tp, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], - ['_5fsafe_5fsequence_3c_20map_3c_20_5fkey_2c_20_5ftp_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_689',['_Safe_sequence< map< _Key, _Tp, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], - ['_5fsafe_5fsequence_3c_20multimap_3c_20_5fkey_2c_20_5ftp_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_690',['_Safe_sequence< multimap< _Key, _Tp, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], - ['_5fsafe_5fsequence_3c_20multiset_3c_20_5fkey_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_691',['_Safe_sequence< multiset< _Key, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], - ['_5fsafe_5fsequence_3c_20set_3c_20_5fkey_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_692',['_Safe_sequence< set< _Key, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], - ['_5fsafe_5fsequence_3c_20vector_3c_20_5ftp_2c_20_5fallocator_20_3e_20_3e_693',['_Safe_sequence< vector< _Tp, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], - ['_5fsafe_5fsequence_5fbase_694',['_Safe_sequence_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08743.html',1,'__gnu_debug']]], - ['_5fsafe_5funordered_5fcontainer_695',['_Safe_unordered_container',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08799.html',1,'__gnu_debug']]], - ['_5fsafe_5funordered_5fcontainer_3c_20unordered_5fmap_3c_20_5fkey_2c_20_5ftp_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_20_3e_696',['_Safe_unordered_container< unordered_map< _Key, _Tp, _Hash, _Pred, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08799.html',1,'']]], - ['_5fsafe_5funordered_5fcontainer_3c_20unordered_5fmultimap_3c_20_5fkey_2c_20_5ftp_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_20_3e_697',['_Safe_unordered_container< unordered_multimap< _Key, _Tp, _Hash, _Pred, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08799.html',1,'']]], - ['_5fsafe_5funordered_5fcontainer_3c_20unordered_5fmultiset_3c_20_5fvalue_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_20_3e_698',['_Safe_unordered_container< unordered_multiset< _Value, _Hash, _Pred, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08799.html',1,'']]], - ['_5fsafe_5funordered_5fcontainer_3c_20unordered_5fset_3c_20_5fvalue_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_20_3e_699',['_Safe_unordered_container< unordered_set< _Value, _Hash, _Pred, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08799.html',1,'']]], - ['_5fsafe_5funordered_5fcontainer_5fbase_700',['_Safe_unordered_container_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08795.html',1,'__gnu_debug']]], - ['_5fsafe_5fvector_701',['_Safe_vector',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08903.html',1,'__gnu_debug']]], - ['_5fsafe_5fvector_3c_20vector_3c_20_5ftp_2c_20_5fallocator_20_3e_2c_20_3a_3avector_3c_20_5ftp_2c_20_5fallocator_20_3e_20_3e_702',['_Safe_vector< vector< _Tp, _Allocator >, ::vector< _Tp, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08903.html',1,'']]], - ['_5fsamplingsorter_703',['_SamplingSorter',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09615.html',1,'__gnu_parallel']]], - ['_5fsamplingsorter_3c_20false_2c_20_5fraiter_2c_20_5fstrictweakordering_20_3e_704',['_SamplingSorter< false, _RAIter, _StrictWeakOrdering >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09619.html',1,'__gnu_parallel']]], - ['_5fscanner_705',['_Scanner',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06895.html',1,'std::__detail']]], - ['_5fsequence_5ftraits_706',['_Sequence_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08755.html',1,'__gnu_debug']]], - ['_5fsequenceindex_707',['_SequenceIndex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a1cbb61a4863a306daa23823d89f9bef1',1,'__gnu_parallel']]], - ['_5fset_708',['_set',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'Eigen::PlainObjectBase::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()']]], - ['_5fset_5fnoalias_709',['_set_noalias',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'Eigen::PlainObjectBase::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()']]], - ['_5fsettings_710',['_Settings',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html',1,'__gnu_parallel']]], - ['_5fsig0_711',['_sig0',['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a26be492f3ccd6ef16124a761ebce996d',1,'cv::ClfOnlineStump']]], - ['_5fsig1_712',['_sig1',['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a85a5f6f1c5b69881073cdd0f3fedf4e4',1,'cv::ClfOnlineStump']]], - ['_5fsortalgorithm_713',['_SortAlgorithm',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a35bfabad218af713f172257aecd8414e',1,'__gnu_parallel']]], - ['_5fsp_5febo_5fhelper_3c_20_5fnm_2c_20_5ftp_2c_20false_20_3e_714',['_Sp_ebo_helper< _Nm, _Tp, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06983.html',1,'std']]], - ['_5fsp_5febo_5fhelper_3c_20_5fnm_2c_20_5ftp_2c_20true_20_3e_715',['_Sp_ebo_helper< _Nm, _Tp, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06979.html',1,'std']]], - ['_5fsplitconsistently_716',['_SplitConsistently',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09631.html',1,'__gnu_parallel']]], - ['_5fsplitconsistently_3c_20false_2c_20_5fraiter_2c_20_5fcompare_2c_20_5fsortingplacesiterator_20_3e_717',['_SplitConsistently< false, _RAIter, _Compare, _SortingPlacesIterator >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09639.html',1,'__gnu_parallel']]], - ['_5fsplitconsistently_3c_20true_2c_20_5fraiter_2c_20_5fcompare_2c_20_5fsortingplacesiterator_20_3e_718',['_SplitConsistently< true, _RAIter, _Compare, _SortingPlacesIterator >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09635.html',1,'__gnu_parallel']]], - ['_5fsplittingalgorithm_719',['_SplittingAlgorithm',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ace24b9f316fde5ea598815403cfd02bb',1,'__gnu_parallel']]], - ['_5fstateseq_720',['_StateSeq',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06807.html',1,'std::__detail']]], - ['_5fstd_5fpointer_5fimpl_721',['_Std_pointer_impl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10539.html',1,'__gnu_cxx']]], - ['_5ftemporary_5fbuffer_722',['_Temporary_buffer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html',1,'std::_Temporary_buffer< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#ae53d1b9aa4d0658c463fbbc6db6adc68',1,'std::_Temporary_buffer::_Temporary_buffer()']]], - ['_5fthreadindex_723',['_ThreadIndex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a05e502e51bfc3233671730f74a44dc6a',1,'__gnu_parallel']]], - ['_5fthreshold_724',['_threshold',['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html#a5ad618d63061dd6d7b32c5c3d8639698',1,'cv::face::BasicFaceRecognizer']]], - ['_5ftransformvector_725',['_transformVector',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aabef1f6fc62535f6f85d590108915ee8',1,'Eigen::QuaternionBase::_transformVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aabef1f6fc62535f6f85d590108915ee8',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::_transformVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aabef1f6fc62535f6f85d590108915ee8',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::_transformVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aabef1f6fc62535f6f85d590108915ee8',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::_transformVector()']]], - ['_5ftuple_5fimpl_726',['_Tuple_impl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02919.html',1,'std']]], - ['_5ftuple_5fimpl_3c_200_2c_20_5felements_2e_2e_2e_20_3e_727',['_Tuple_impl< 0, _Elements... >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02919.html',1,'']]], - ['_5ftuple_5fimpl_3c_200_2c_20_5ft1_2c_20_5ft2_20_3e_728',['_Tuple_impl< 0, _T1, _T2 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02919.html',1,'']]], - ['_5ftuple_5fimpl_3c_20_5fidx_2b1_2c_20_5ftail_2e_2e_2e_20_3e_729',['_Tuple_impl< _Idx+1, _Tail... >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02919.html',1,'']]], - ['_5ftuple_5fimpl_3c_20_5fidx_2c_20_5fhead_2c_20_5ftail_2e_2e_2e_20_3e_730',['_Tuple_impl< _Idx, _Head, _Tail... >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02923.html',1,'std']]], - ['_5fui1_731',['_ui1',['https://docs.opencv.org/4.2.0/d8/d94/structHaarClassifierNodeDescriptor32.html#a8c8a76ce219a5f53be95c4f2e1442360',1,'HaarClassifierNodeDescriptor32']]], - ['_5fui2_732',['_ui2',['https://docs.opencv.org/4.2.0/d1/d74/structHaarFeature64.html#a16782e283a7890da0764c6ac79bba38b',1,'HaarFeature64::_ui2'],['https://docs.opencv.org/4.2.0/d5/d37/structHaarStage64.html#a452b9819c2b01d11bded00da0e7d8696',1,'HaarStage64::_ui2']]], - ['_5fui4_733',['_ui4',['https://docs.opencv.org/4.2.0/de/db5/structHaarClassifierNode128.html#a78fa750306e6011c2cb0925c970a69f8',1,'HaarClassifierNode128']]], - ['_5funchecked_5fflip_734',['_Unchecked_flip',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga3ae4b2fca495c3dc883f9e05ea618538',1,'std::bitset::_Unchecked_flip(size_t __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga3ae4b2fca495c3dc883f9e05ea618538',1,'std::bitset::_Unchecked_flip(size_t __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga3ae4b2fca495c3dc883f9e05ea618538',1,'_Unchecked_flip()(Global Namespace)']]], - ['_5funchecked_5freset_735',['_Unchecked_reset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaf6f4ee325fdf30171454f70ac153374b',1,'std::bitset::_Unchecked_reset(size_t __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaf6f4ee325fdf30171454f70ac153374b',1,'std::bitset::_Unchecked_reset(size_t __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaf6f4ee325fdf30171454f70ac153374b',1,'_Unchecked_reset()(Global Namespace)']]], - ['_5funchecked_5fset_736',['_Unchecked_set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gab46cfb783c57ffc53976ee861fae1ff4',1,'std::bitset::_Unchecked_set(size_t __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaf6e22292e9928712291bfdfc899e32fe',1,'std::bitset::_Unchecked_set(size_t __pos, int __val) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gab46cfb783c57ffc53976ee861fae1ff4',1,'std::bitset::_Unchecked_set(size_t __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaf6e22292e9928712291bfdfc899e32fe',1,'std::bitset::_Unchecked_set(size_t __pos, int __val) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gab46cfb783c57ffc53976ee861fae1ff4',1,'_Unchecked_set(size_t __pos) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaf6e22292e9928712291bfdfc899e32fe',1,'_Unchecked_set(size_t __pos, int __val) noexcept(Global Namespace)']]], - ['_5funchecked_5ftest_737',['_Unchecked_test',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga937a54ac511a8847838de564dbe17e39',1,'std::bitset::_Unchecked_test(size_t __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga937a54ac511a8847838de564dbe17e39',1,'std::bitset::_Unchecked_test(size_t __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga937a54ac511a8847838de564dbe17e39',1,'_Unchecked_test()(Global Namespace)']]], - ['_5funqualified_5ftype_738',['_Unqualified_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10575.html',1,'__gnu_cxx']]], - ['_5fvector_5fbase_739',['_Vector_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'std']]], - ['_5fvector_5fbase_3c_20_5f_5fdiff_5ftype_2c_20std_3a_3aallocator_3c_20_5f_5fdiff_5ftype_20_3e_20_3e_740',['_Vector_base< __diff_type, std::allocator< __diff_type > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20_5f_5fgnu_5fparallel_3a_3a_5fpiece_3c_20_5fdifferencetype_20_3e_2c_20std_3a_3aallocator_3c_20_5f_5fgnu_5fparallel_3a_3a_5fpiece_3c_20_5fdifferencetype_20_3e_20_3e_20_3e_741',['_Vector_base< __gnu_parallel::_Piece< _DifferenceType >, std::allocator< __gnu_parallel::_Piece< _DifferenceType > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20_5fcharclasst_2c_20std_3a_3aallocator_3c_20_5fcharclasst_20_3e_20_3e_742',['_Vector_base< _CharClassT, std::allocator< _CharClassT > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20_5fchart_2c_20std_3a_3aallocator_3c_20_5fchart_20_3e_20_3e_743',['_Vector_base< _CharT, std::allocator< _CharT > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20_5fcmpt_2c_20std_3a_3aallocator_3c_20_5fcmpt_20_3e_20_3e_744',['_Vector_base< _Cmpt, std::allocator< _Cmpt > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20_5fnode_20_2a_2c_20_5fnodeptr_5falloc_20_3e_745',['_Vector_base< _Node *, _Nodeptr_Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20_5frealtype_2c_20std_3a_3aallocator_3c_20_5frealtype_20_3e_20_3e_746',['_Vector_base< _RealType, std::allocator< _RealType > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20_5fstate_3c_20_5ftraitst_3a_3achar_5ftype_20_3e_2c_20std_3a_3aallocator_3c_20_5fstate_3c_20_5ftraitst_3a_3achar_5ftype_20_3e_20_3e_20_3e_747',['_Vector_base< _State< _TraitsT::char_type >, std::allocator< _State< _TraitsT::char_type > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20_5fstringt_2c_20std_3a_3aallocator_3c_20_5fstringt_20_3e_20_3e_748',['_Vector_base< _StringT, std::allocator< _StringT > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20block_5ftype_2c_20allocator_5ftype_20_3e_749',['_Vector_base< block_type, allocator_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20catalog_5finfo_20_2a_2c_20std_3a_3aallocator_3c_20catalog_5finfo_20_2a_20_3e_20_3e_750',['_Vector_base< Catalog_info *, std::allocator< Catalog_info * > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20double_2c_20std_3a_3aallocator_3c_20double_20_3e_20_3e_751',['_Vector_base< double, std::allocator< double > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20int_2c_20std_3a_3aallocator_3c_20int_20_3e_20_3e_752',['_Vector_base< int, std::allocator< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20result_5ftype_2c_20std_3a_3aallocator_3c_20result_5ftype_20_3e_20_3e_753',['_Vector_base< result_type, std::allocator< result_type > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20size_5ft_2c_20std_3a_3aallocator_3c_20size_5ft_20_3e_20_3e_754',['_Vector_base< size_t, std::allocator< size_t > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20std_3a_3apair_3c_20_5fbiiter_2c_20int_20_3e_2c_20std_3a_3aallocator_3c_20std_3a_3apair_3c_20_5fbiiter_2c_20int_20_3e_20_3e_20_3e_755',['_Vector_base< std::pair< _BiIter, int >, std::allocator< std::pair< _BiIter, int > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20std_3a_3apair_3c_20_5fstateidt_2c_20std_3a_3avector_20_3e_2c_20std_3a_3aallocator_3c_20std_3a_3apair_3c_20_5fstateidt_2c_20std_3a_3avector_20_3e_20_3e_20_3e_756',['_Vector_base< std::pair< _StateIdT, std::vector >, std::allocator< std::pair< _StateIdT, std::vector > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20std_3a_3apair_3c_20_5fstrtranst_2c_20_5fstrtranst_20_3e_2c_20std_3a_3aallocator_3c_20std_3a_3apair_3c_20_5fstrtranst_2c_20_5fstrtranst_20_3e_20_3e_20_3e_757',['_Vector_base< std::pair< _StrTransT, _StrTransT >, std::allocator< std::pair< _StrTransT, _StrTransT > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_2c_20_5falloc_20_3e_758',['_Vector_base< sub_match< _Bi_iter >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_2c_20allocator_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_20_3e_20_3e_759',['_Vector_base< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fvector_5fbase_3c_20sub_5fmatch_3c_20_5fbiiter_20_3e_2c_20_5falloc_20_3e_760',['_Vector_base< sub_match< _BiIter >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], - ['_5fweak_5fresult_5ftype_761',['_Weak_result_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06675.html',1,'std']]], - ['_5fweak_5fresult_5ftype_3c_20_5ftp_20_3e_762',['_Weak_result_type< _Tp >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06675.html',1,'']]], - ['_5fweak_5fresult_5ftype_3c_20remove_5fcv_3c_20_5ftp_20_3e_3a_3atype_20_3e_763',['_Weak_result_type< remove_cv< _Tp >::type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06675.html',1,'']]], - ['_5fweak_5fresult_5ftype_5fimpl_764',['_Weak_result_type_impl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06643.html',1,'std']]], - ['_5fweak_5fresult_5ftype_5fimpl_3c_20_5fres_28_2a_29_28_5fargtypes_2e_2e_2e_29_20_5fglibcxx_5fnoexcept_5fqual_20_3e_765',['_Weak_result_type_impl< _Res(*)(_ArgTypes...) _GLIBCXX_NOEXCEPT_QUAL >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06655.html',1,'std']]], - ['_5fweak_5fresult_5ftype_5fimpl_3c_20_5fres_28_2a_29_28_5fargtypes_2e_2e_2e_2e_2e_2e_29_20_5fglibcxx_5fnoexcept_5fqual_20_3e_766',['_Weak_result_type_impl< _Res(*)(_ArgTypes......) _GLIBCXX_NOEXCEPT_QUAL >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06659.html',1,'std']]], - ['_5fweak_5fresult_5ftype_5fimpl_3c_20_5fres_28_5fargtypes_2e_2e_2e_29_20_5fglibcxx_5fnoexcept_5fqual_20_3e_767',['_Weak_result_type_impl< _Res(_ArgTypes...) _GLIBCXX_NOEXCEPT_QUAL >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06647.html',1,'std']]], - ['_5fweak_5fresult_5ftype_5fimpl_3c_20_5fres_28_5fargtypes_2e_2e_2e_2e_2e_2e_29_20_5fglibcxx_5fnoexcept_5fqual_20_3e_768',['_Weak_result_type_impl< _Res(_ArgTypes......) _GLIBCXX_NOEXCEPT_QUAL >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06651.html',1,'std']]], - ['_5fweak_5fresult_5ftype_5fimpl_3c_20remove_5fcv_3c_20_5ffunctor_20_3e_3a_3atype_20_3e_769',['_Weak_result_type_impl< remove_cv< _Functor >::type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06643.html',1,'']]], - ['_5fweak_5fresult_5ftype_5fimpl_3c_20remove_5fcv_3c_20_5ftp_20_3e_3a_3atype_20_3e_770',['_Weak_result_type_impl< remove_cv< _Tp >::type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06643.html',1,'']]], - ['_5fweak_5fresult_5ftype_5fimpl_3c_20remove_5fcv_3c_20remove_5fcv_3c_20_5ftp_20_3e_3a_3atype_20_3e_3a_3atype_20_3e_771',['_Weak_result_type_impl< remove_cv< remove_cv< _Tp >::type >::type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06643.html',1,'']]], - ['_5fwidth_772',['_width',['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#ac1765499d71d87ce0e02c562403eb7d5',1,'NCVMatrix']]], - ['_5fwritefeatures_773',['_writeFeatures',['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga8c315fda8f95f98459daaefd502551b9',1,'cv::_writeFeatures()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga8c315fda8f95f98459daaefd502551b9',1,'_writeFeatures()(Global Namespace)']]] + ['_5fref_633',['_ref',['https://docs.opencv.org/4.2.0/d7/d80/classcv_1_1quality_1_1QualityMSE.html#ac63637fb1fb813c36dd9dbd0a4a50797',1,'cv::quality::QualityMSE']]], + ['_5freference_5fwrapper_5fbase_634',['_Reference_wrapper_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06695.html',1,'std']]], + ['_5freference_5fwrapper_5fbase_3c_20remove_5fcv_3c_20_5ftp_20_3e_3a_3atype_20_3e_635',['_Reference_wrapper_base< remove_cv< _Tp >::type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06695.html',1,'']]], + ['_5frefimgdata_636',['_refImgData',['https://docs.opencv.org/4.2.0/d8/d81/classcv_1_1quality_1_1QualityGMSD.html#acb7c1766c0dea9c59f0b363a54e650ac',1,'cv::quality::QualityGMSD::_refImgData'],['https://docs.opencv.org/4.2.0/d9/db5/classcv_1_1quality_1_1QualitySSIM.html#a6ecb65c443c7f7ae202d9636b4e26e7e',1,'cv::quality::QualitySSIM::_refImgData']]], + ['_5frehash_5fbase_637',['_Rehash_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05759.html',1,'std::__detail']]], + ['_5frehash_5fbase_3c_20_5fkey_2c_20_5fvalue_2c_20_5falloc_2c_20_5fextractkey_2c_20_5fequal_2c_20_5fh1_2c_20_5fh2_2c_20_5fhash_2c_20_5frehashpolicy_2c_20_5ftraits_20_3e_638',['_Rehash_base< _Key, _Value, _Alloc, _ExtractKey, _Equal, _H1, _H2, _Hash, _RehashPolicy, _Traits >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05759.html',1,'']]], + ['_5frehash_5fbase_3c_20_5fkey_2c_20_5fvalue_2c_20_5falloc_2c_20_5fextractkey_2c_20_5fequal_2c_20_5fh1_2c_20_5fh2_2c_20_5fhash_2c_20_5frehashpolicy_2c_20_5ftraits_2c_20std_3a_3afalse_5ftype_20_3e_639',['_Rehash_base< _Key, _Value, _Alloc, _ExtractKey, _Equal, _H1, _H2, _Hash, _RehashPolicy, _Traits, std::false_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05763.html',1,'std::__detail']]], + ['_5frehash_5fbase_3c_20_5fkey_2c_20_5fvalue_2c_20_5falloc_2c_20_5fextractkey_2c_20_5fequal_2c_20_5fh1_2c_20_5fh2_2c_20_5fhash_2c_20_5frehashpolicy_2c_20_5ftraits_2c_20std_3a_3atrue_5ftype_20_3e_640',['_Rehash_base< _Key, _Value, _Alloc, _ExtractKey, _Equal, _H1, _H2, _Hash, _RehashPolicy, _Traits, std::true_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05767.html',1,'std::__detail']]], + ['_5frelative_5fpointer_5fimpl_641',['_Relative_pointer_impl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10543.html',1,'__gnu_cxx']]], + ['_5frelative_5fpointer_5fimpl_3c_20const_20_5ftp_20_3e_642',['_Relative_pointer_impl< const _Tp >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10547.html',1,'__gnu_cxx']]], + ['_5fresize_5fto_5fmatch_643',['_resize_to_match',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'Eigen::PlainObjectBase::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a35c62d0feeb92a83704d518402cdbfdf',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_resize_to_match()']]], + ['_5frestrictedboundedconcurrentqueue_644',['_RestrictedBoundedConcurrentQueue',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html',1,'__gnu_parallel::_RestrictedBoundedConcurrentQueue< _Tp >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#a7070da9f66983a3fa24ae4dc92614c0c',1,'__gnu_parallel::_RestrictedBoundedConcurrentQueue::_RestrictedBoundedConcurrentQueue()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html#a7070da9f66983a3fa24ae4dc92614c0c',1,'_RestrictedBoundedConcurrentQueue< pair< _RAIter, _RAIter > >::_RestrictedBoundedConcurrentQueue()']]], + ['_5frestrictedboundedconcurrentqueue_3c_20pair_3c_20_5fraiter_2c_20_5fraiter_20_3e_20_3e_645',['_RestrictedBoundedConcurrentQueue< pair< _RAIter, _RAIter > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html',1,'']]], + ['_5frestrictedboundedconcurrentqueue_3c_20std_3a_3apair_20_3e_646',['_RestrictedBoundedConcurrentQueue< std::pair >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09667.html',1,'__gnu_parallel']]], + ['_5fresult_647',['_Result',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02267.html',1,'std::__future_base']]], + ['_5fresult_3c_20_5fres_20_26_20_3e_648',['_Result< _Res & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02327.html',1,'std::__future_base']]], + ['_5fresult_3c_20void_20_3e_649',['_Result< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02331.html',1,'std::__future_base']]], + ['_5fresult_5falloc_650',['_Result_alloc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02271.html',1,'std::__future_base']]], + ['_5fresult_5fbase_651',['_Result_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02259.html',1,'std::__future_base']]], + ['_5fs_652',['_s',['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a679c37671185a138e48bb4ab491afa3f',1,'cv::ClfOnlineStump']]], + ['_5fs_5fconstant_653',['_S_constant',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#aecb3969b2c41415a01b68e6d8130538d',1,'__gnu_debug::_Safe_iterator::_S_constant()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a65378aa3baca9f98cbc4bf7e0049a8c8',1,'__gnu_debug::_Safe_local_iterator::_S_constant()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#aecb3969b2c41415a01b68e6d8130538d',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::_S_constant()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#aecb3969b2c41415a01b68e6d8130538d',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::_S_constant()']]], + ['_5fsafe_5fcontainer_654',['_Safe_container',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'__gnu_debug']]], + ['_5fsafe_5fcontainer_3c_20basic_5fstring_3c_20_5fchart_2c_20_5ftraits_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5fsafe_5fsequence_2c_20bool_28_5fglibcxx_5fuse_5fcxx11_5fabi_29_3e_655',['_Safe_container< basic_string< _CharT, _Traits, _Allocator >, _Allocator, _Safe_sequence, bool(_GLIBCXX_USE_CXX11_ABI)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fcontainer_3c_20deque_3c_20_5ftp_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fsequence_20_3e_656',['_Safe_container< deque< _Tp, _Allocator >, _Allocator, __gnu_debug::_Safe_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fcontainer_3c_20forward_5flist_3c_20_5ftp_2c_20_5falloc_20_3e_2c_20_5falloc_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fforward_5flist_20_3e_657',['_Safe_container< forward_list< _Tp, _Alloc >, _Alloc, __gnu_debug::_Safe_forward_list >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fcontainer_3c_20list_3c_20_5ftp_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fnode_5fsequence_20_3e_658',['_Safe_container< list< _Tp, _Allocator >, _Allocator, __gnu_debug::_Safe_node_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fcontainer_3c_20map_3c_20_5fkey_2c_20_5ftp_2c_20_5fcompare_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fnode_5fsequence_20_3e_659',['_Safe_container< map< _Key, _Tp, _Compare, _Allocator >, _Allocator, __gnu_debug::_Safe_node_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fcontainer_3c_20multimap_3c_20_5fkey_2c_20_5ftp_2c_20_5fcompare_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fnode_5fsequence_20_3e_660',['_Safe_container< multimap< _Key, _Tp, _Compare, _Allocator >, _Allocator, __gnu_debug::_Safe_node_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fcontainer_3c_20multiset_3c_20_5fkey_2c_20_5fcompare_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fnode_5fsequence_20_3e_661',['_Safe_container< multiset< _Key, _Compare, _Allocator >, _Allocator, __gnu_debug::_Safe_node_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fcontainer_3c_20set_3c_20_5fkey_2c_20_5fcompare_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fnode_5fsequence_20_3e_662',['_Safe_container< set< _Key, _Compare, _Allocator >, _Allocator, __gnu_debug::_Safe_node_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fcontainer_3c_20unordered_5fmap_3c_20_5fkey_2c_20_5ftp_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_2c_20_5falloc_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5funordered_5fcontainer_20_3e_663',['_Safe_container< unordered_map< _Key, _Tp, _Hash, _Pred, _Alloc >, _Alloc, __gnu_debug::_Safe_unordered_container >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fcontainer_3c_20unordered_5fmultimap_3c_20_5fkey_2c_20_5ftp_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_2c_20_5falloc_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5funordered_5fcontainer_20_3e_664',['_Safe_container< unordered_multimap< _Key, _Tp, _Hash, _Pred, _Alloc >, _Alloc, __gnu_debug::_Safe_unordered_container >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fcontainer_3c_20unordered_5fmultiset_3c_20_5fvalue_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_2c_20_5falloc_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5funordered_5fcontainer_20_3e_665',['_Safe_container< unordered_multiset< _Value, _Hash, _Pred, _Alloc >, _Alloc, __gnu_debug::_Safe_unordered_container >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fcontainer_3c_20unordered_5fset_3c_20_5fvalue_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_2c_20_5falloc_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5funordered_5fcontainer_20_3e_666',['_Safe_container< unordered_set< _Value, _Hash, _Pred, _Alloc >, _Alloc, __gnu_debug::_Safe_unordered_container >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fcontainer_3c_20vector_3c_20_5ftp_2c_20_5fallocator_20_3e_2c_20_5fallocator_2c_20_5f_5fgnu_5fdebug_3a_3a_5fsafe_5fsequence_20_3e_667',['_Safe_container< vector< _Tp, _Allocator >, _Allocator, __gnu_debug::_Safe_sequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08747.html',1,'']]], + ['_5fsafe_5fforward_5flist_668',['_Safe_forward_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08847.html',1,'__gnu_debug']]], + ['_5fsafe_5fforward_5flist_3c_20forward_5flist_3c_20_5ftp_2c_20_5falloc_20_3e_20_3e_669',['_Safe_forward_list< forward_list< _Tp, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08847.html',1,'']]], + ['_5fsafe_5fiterator_670',['_Safe_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html',1,'__gnu_debug::_Safe_iterator< _Iterator, _Sequence, _Category >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#aafbf4eeec97f82fe9ef786e2e1b8cebf',1,'__gnu_debug::_Safe_iterator::_Safe_iterator() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#abf10f26b438e7b11af47be15ec965f33',1,'__gnu_debug::_Safe_iterator::_Safe_iterator(_Iterator __i, const _Safe_sequence_base *__seq) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a12cb2be26e6bd1c50970282d47a15a54',1,'__gnu_debug::_Safe_iterator::_Safe_iterator(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a14fc079f9d52ed25624839bf56d6e0bb',1,'__gnu_debug::_Safe_iterator::_Safe_iterator(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a6e50cd4b55f01b8c305e501bde8f8c2f',1,'__gnu_debug::_Safe_iterator::_Safe_iterator(const _Safe_iterator< _MutableIterator, _Sequence, typename __gnu_cxx::__enable_if< _IsConstant::__value &&std::__are_same< _MutableIterator, _OtherIterator >::__value, _Category >::__type > &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#aafbf4eeec97f82fe9ef786e2e1b8cebf',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::_Safe_iterator() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#abf10f26b438e7b11af47be15ec965f33',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::_Safe_iterator(_Iterator __i, const _Safe_sequence_base *__seq) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a12cb2be26e6bd1c50970282d47a15a54',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::_Safe_iterator(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a14fc079f9d52ed25624839bf56d6e0bb',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::_Safe_iterator(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a6e50cd4b55f01b8c305e501bde8f8c2f',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::_Safe_iterator(const _Safe_iterator< _MutableIterator, _Sequence, typename __gnu_cxx::__enable_if< _IsConstant::__value &&std::__are_same< _MutableIterator, _OtherIterator >::__value, std::bidirectional_iterator_tag >::__type > &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#aafbf4eeec97f82fe9ef786e2e1b8cebf',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::_Safe_iterator() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#abf10f26b438e7b11af47be15ec965f33',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::_Safe_iterator(_Iterator __i, const _Safe_sequence_base *__seq) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a12cb2be26e6bd1c50970282d47a15a54',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::_Safe_iterator(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a14fc079f9d52ed25624839bf56d6e0bb',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::_Safe_iterator(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a6e50cd4b55f01b8c305e501bde8f8c2f',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::_Safe_iterator(const _Safe_iterator< _MutableIterator, _Sequence, typename __gnu_cxx::__enable_if< _IsConstant::__value &&std::__are_same< _MutableIterator, _OtherIterator >::__value, std::forward_iterator_tag >::__type > &__x) noexcept']]], + ['_5fsafe_5fiterator_3c_20_5fiterator_2c_20_5fsequence_2c_20std_3a_3abidirectional_5fiterator_5ftag_20_3e_671',['_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html',1,'']]], + ['_5fsafe_5fiterator_3c_20_5fiterator_2c_20_5fsequence_2c_20std_3a_3aforward_5fiterator_5ftag_20_3e_672',['_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html',1,'']]], + ['_5fsafe_5fiterator_5fbase_673',['_Safe_iterator_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08739.html',1,'__gnu_debug::_Safe_iterator_base'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08739.html#a3e6e1cb37b5585e5ee3b254bbd7d5cbb',1,'__gnu_debug::_Safe_iterator_base::_Safe_iterator_base()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08739.html#a74a667bf14e3feb71571c352430fcf12',1,'__gnu_debug::_Safe_iterator_base::_Safe_iterator_base(const _Safe_sequence_base *__seq, bool __constant)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08739.html#a0993fe5b5c385572b6261e2100f01191',1,'__gnu_debug::_Safe_iterator_base::_Safe_iterator_base(const _Safe_iterator_base &__x, bool __constant)']]], + ['_5fsafe_5flocal_5fiterator_674',['_Safe_local_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html',1,'__gnu_debug::_Safe_local_iterator< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#adc916fc873a967e3c62525fb890de36b',1,'__gnu_debug::_Safe_local_iterator::_Safe_local_iterator() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a380abe1aa1ff4af91374084189f86ed0',1,'__gnu_debug::_Safe_local_iterator::_Safe_local_iterator(_Iterator __i, const _Safe_sequence_base *__cont)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a0a7e70d70fe6ebf02a59eb4ed6704642',1,'__gnu_debug::_Safe_local_iterator::_Safe_local_iterator(const _Safe_local_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a281a8ffa72a96b7599ad892efc6f4367',1,'__gnu_debug::_Safe_local_iterator::_Safe_local_iterator(_Safe_local_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#ab45913e372960af8e21c2e246563e815',1,'__gnu_debug::_Safe_local_iterator::_Safe_local_iterator(const _Safe_local_iterator< _MutableIterator, typename __gnu_cxx::__enable_if< _IsConstant::__value &&std::__are_same< _MutableIterator, _OtherIterator >::__value, _Sequence >::__type > &__x) noexcept']]], + ['_5fsafe_5flocal_5fiterator_5fbase_675',['_Safe_local_iterator_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08791.html',1,'__gnu_debug::_Safe_local_iterator_base'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08791.html#ad7d51ed8396149f6d4d44e9bbf48ddf3',1,'__gnu_debug::_Safe_local_iterator_base::_Safe_local_iterator_base()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08791.html#a7958bccd20b93cf3f6cffc4ed922346d',1,'__gnu_debug::_Safe_local_iterator_base::_Safe_local_iterator_base(const _Safe_sequence_base *__seq, bool __constant)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08791.html#aba66dde2adb286395bcb7714f32e64d9',1,'__gnu_debug::_Safe_local_iterator_base::_Safe_local_iterator_base(const _Safe_local_iterator_base &__x, bool __constant)']]], + ['_5fsafe_5fnode_5fsequence_676',['_Safe_node_sequence',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08787.html',1,'__gnu_debug']]], + ['_5fsafe_5fnode_5fsequence_3c_20list_3c_20_5ftp_2c_20_5fallocator_20_3e_20_3e_677',['_Safe_node_sequence< list< _Tp, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08787.html',1,'']]], + ['_5fsafe_5fnode_5fsequence_3c_20map_3c_20_5fkey_2c_20_5ftp_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_678',['_Safe_node_sequence< map< _Key, _Tp, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08787.html',1,'']]], + ['_5fsafe_5fnode_5fsequence_3c_20multimap_3c_20_5fkey_2c_20_5ftp_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_679',['_Safe_node_sequence< multimap< _Key, _Tp, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08787.html',1,'']]], + ['_5fsafe_5fnode_5fsequence_3c_20multiset_3c_20_5fkey_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_680',['_Safe_node_sequence< multiset< _Key, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08787.html',1,'']]], + ['_5fsafe_5fnode_5fsequence_3c_20set_3c_20_5fkey_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_681',['_Safe_node_sequence< set< _Key, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08787.html',1,'']]], + ['_5fsafe_5fsequence_682',['_Safe_sequence',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'__gnu_debug']]], + ['_5fsafe_5fsequence_3c_20_5fsafesequence_20_3e_683',['_Safe_sequence< _SafeSequence >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], + ['_5fsafe_5fsequence_3c_20basic_5fstring_3c_20_5fchart_2c_20_5ftraits_2c_20_5fallocator_20_3e_20_3e_684',['_Safe_sequence< basic_string< _CharT, _Traits, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], + ['_5fsafe_5fsequence_3c_20deque_3c_20_5ftp_2c_20_5fallocator_20_3e_20_3e_685',['_Safe_sequence< deque< _Tp, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], + ['_5fsafe_5fsequence_3c_20forward_5flist_3c_20_5ftp_2c_20_5falloc_20_3e_20_3e_686',['_Safe_sequence< forward_list< _Tp, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], + ['_5fsafe_5fsequence_3c_20list_3c_20_5ftp_2c_20_5fallocator_20_3e_20_3e_687',['_Safe_sequence< list< _Tp, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], + ['_5fsafe_5fsequence_3c_20map_3c_20_5fkey_2c_20_5ftp_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_688',['_Safe_sequence< map< _Key, _Tp, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], + ['_5fsafe_5fsequence_3c_20multimap_3c_20_5fkey_2c_20_5ftp_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_689',['_Safe_sequence< multimap< _Key, _Tp, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], + ['_5fsafe_5fsequence_3c_20multiset_3c_20_5fkey_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_690',['_Safe_sequence< multiset< _Key, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], + ['_5fsafe_5fsequence_3c_20set_3c_20_5fkey_2c_20_5fcompare_2c_20_5fallocator_20_3e_20_3e_691',['_Safe_sequence< set< _Key, _Compare, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], + ['_5fsafe_5fsequence_3c_20vector_3c_20_5ftp_2c_20_5fallocator_20_3e_20_3e_692',['_Safe_sequence< vector< _Tp, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08651.html',1,'']]], + ['_5fsafe_5fsequence_5fbase_693',['_Safe_sequence_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08743.html',1,'__gnu_debug']]], + ['_5fsafe_5funordered_5fcontainer_694',['_Safe_unordered_container',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08799.html',1,'__gnu_debug']]], + ['_5fsafe_5funordered_5fcontainer_3c_20unordered_5fmap_3c_20_5fkey_2c_20_5ftp_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_20_3e_695',['_Safe_unordered_container< unordered_map< _Key, _Tp, _Hash, _Pred, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08799.html',1,'']]], + ['_5fsafe_5funordered_5fcontainer_3c_20unordered_5fmultimap_3c_20_5fkey_2c_20_5ftp_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_20_3e_696',['_Safe_unordered_container< unordered_multimap< _Key, _Tp, _Hash, _Pred, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08799.html',1,'']]], + ['_5fsafe_5funordered_5fcontainer_3c_20unordered_5fmultiset_3c_20_5fvalue_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_20_3e_697',['_Safe_unordered_container< unordered_multiset< _Value, _Hash, _Pred, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08799.html',1,'']]], + ['_5fsafe_5funordered_5fcontainer_3c_20unordered_5fset_3c_20_5fvalue_2c_20_5fhash_2c_20_5fpred_2c_20_5falloc_20_3e_20_3e_698',['_Safe_unordered_container< unordered_set< _Value, _Hash, _Pred, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08799.html',1,'']]], + ['_5fsafe_5funordered_5fcontainer_5fbase_699',['_Safe_unordered_container_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08795.html',1,'__gnu_debug']]], + ['_5fsafe_5fvector_700',['_Safe_vector',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08903.html',1,'__gnu_debug']]], + ['_5fsafe_5fvector_3c_20vector_3c_20_5ftp_2c_20_5fallocator_20_3e_2c_20_3a_3avector_3c_20_5ftp_2c_20_5fallocator_20_3e_20_3e_701',['_Safe_vector< vector< _Tp, _Allocator >, ::vector< _Tp, _Allocator > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08903.html',1,'']]], + ['_5fsamplingsorter_702',['_SamplingSorter',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09615.html',1,'__gnu_parallel']]], + ['_5fsamplingsorter_3c_20false_2c_20_5fraiter_2c_20_5fstrictweakordering_20_3e_703',['_SamplingSorter< false, _RAIter, _StrictWeakOrdering >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09619.html',1,'__gnu_parallel']]], + ['_5fscanner_704',['_Scanner',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06895.html',1,'std::__detail']]], + ['_5fsequence_5ftraits_705',['_Sequence_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08755.html',1,'__gnu_debug']]], + ['_5fsequenceindex_706',['_SequenceIndex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a1cbb61a4863a306daa23823d89f9bef1',1,'__gnu_parallel']]], + ['_5fset_707',['_set',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'Eigen::PlainObjectBase::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a09c4b519ee4c635144581e9fe03b6174',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set()']]], + ['_5fset_5fnoalias_708',['_set_noalias',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'Eigen::PlainObjectBase::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#af638f6f03edf4384b1ff1070485987b6',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::_set_noalias()']]], + ['_5fsettings_709',['_Settings',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html',1,'__gnu_parallel']]], + ['_5fsig0_710',['_sig0',['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a26be492f3ccd6ef16124a761ebce996d',1,'cv::ClfOnlineStump']]], + ['_5fsig1_711',['_sig1',['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a85a5f6f1c5b69881073cdd0f3fedf4e4',1,'cv::ClfOnlineStump']]], + ['_5fsortalgorithm_712',['_SortAlgorithm',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a35bfabad218af713f172257aecd8414e',1,'__gnu_parallel']]], + ['_5fsp_5febo_5fhelper_3c_20_5fnm_2c_20_5ftp_2c_20false_20_3e_713',['_Sp_ebo_helper< _Nm, _Tp, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06983.html',1,'std']]], + ['_5fsp_5febo_5fhelper_3c_20_5fnm_2c_20_5ftp_2c_20true_20_3e_714',['_Sp_ebo_helper< _Nm, _Tp, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06979.html',1,'std']]], + ['_5fsplitconsistently_715',['_SplitConsistently',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09631.html',1,'__gnu_parallel']]], + ['_5fsplitconsistently_3c_20false_2c_20_5fraiter_2c_20_5fcompare_2c_20_5fsortingplacesiterator_20_3e_716',['_SplitConsistently< false, _RAIter, _Compare, _SortingPlacesIterator >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09639.html',1,'__gnu_parallel']]], + ['_5fsplitconsistently_3c_20true_2c_20_5fraiter_2c_20_5fcompare_2c_20_5fsortingplacesiterator_20_3e_717',['_SplitConsistently< true, _RAIter, _Compare, _SortingPlacesIterator >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09635.html',1,'__gnu_parallel']]], + ['_5fsplittingalgorithm_718',['_SplittingAlgorithm',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ace24b9f316fde5ea598815403cfd02bb',1,'__gnu_parallel']]], + ['_5fstateseq_719',['_StateSeq',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06807.html',1,'std::__detail']]], + ['_5fstd_5fpointer_5fimpl_720',['_Std_pointer_impl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10539.html',1,'__gnu_cxx']]], + ['_5ftemporary_5fbuffer_721',['_Temporary_buffer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html',1,'std::_Temporary_buffer< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#ae53d1b9aa4d0658c463fbbc6db6adc68',1,'std::_Temporary_buffer::_Temporary_buffer()']]], + ['_5fthreadindex_722',['_ThreadIndex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a05e502e51bfc3233671730f74a44dc6a',1,'__gnu_parallel']]], + ['_5fthreshold_723',['_threshold',['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html#a5ad618d63061dd6d7b32c5c3d8639698',1,'cv::face::BasicFaceRecognizer']]], + ['_5ftransformvector_724',['_transformVector',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aabef1f6fc62535f6f85d590108915ee8',1,'Eigen::QuaternionBase::_transformVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aabef1f6fc62535f6f85d590108915ee8',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::_transformVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aabef1f6fc62535f6f85d590108915ee8',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::_transformVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aabef1f6fc62535f6f85d590108915ee8',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::_transformVector()']]], + ['_5ftuple_5fimpl_725',['_Tuple_impl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02919.html',1,'std']]], + ['_5ftuple_5fimpl_3c_200_2c_20_5felements_2e_2e_2e_20_3e_726',['_Tuple_impl< 0, _Elements... >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02919.html',1,'']]], + ['_5ftuple_5fimpl_3c_200_2c_20_5ft1_2c_20_5ft2_20_3e_727',['_Tuple_impl< 0, _T1, _T2 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02919.html',1,'']]], + ['_5ftuple_5fimpl_3c_20_5fidx_2b1_2c_20_5ftail_2e_2e_2e_20_3e_728',['_Tuple_impl< _Idx+1, _Tail... >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02919.html',1,'']]], + ['_5ftuple_5fimpl_3c_20_5fidx_2c_20_5fhead_2c_20_5ftail_2e_2e_2e_20_3e_729',['_Tuple_impl< _Idx, _Head, _Tail... >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02923.html',1,'std']]], + ['_5fui1_730',['_ui1',['https://docs.opencv.org/4.2.0/d8/d94/structHaarClassifierNodeDescriptor32.html#a8c8a76ce219a5f53be95c4f2e1442360',1,'HaarClassifierNodeDescriptor32']]], + ['_5fui2_731',['_ui2',['https://docs.opencv.org/4.2.0/d1/d74/structHaarFeature64.html#a16782e283a7890da0764c6ac79bba38b',1,'HaarFeature64::_ui2'],['https://docs.opencv.org/4.2.0/d5/d37/structHaarStage64.html#a452b9819c2b01d11bded00da0e7d8696',1,'HaarStage64::_ui2']]], + ['_5fui4_732',['_ui4',['https://docs.opencv.org/4.2.0/de/db5/structHaarClassifierNode128.html#a78fa750306e6011c2cb0925c970a69f8',1,'HaarClassifierNode128']]], + ['_5funchecked_5fflip_733',['_Unchecked_flip',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga3ae4b2fca495c3dc883f9e05ea618538',1,'std::bitset::_Unchecked_flip(size_t __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga3ae4b2fca495c3dc883f9e05ea618538',1,'std::bitset::_Unchecked_flip(size_t __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga3ae4b2fca495c3dc883f9e05ea618538',1,'_Unchecked_flip()(Global Namespace)']]], + ['_5funchecked_5freset_734',['_Unchecked_reset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaf6f4ee325fdf30171454f70ac153374b',1,'std::bitset::_Unchecked_reset(size_t __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaf6f4ee325fdf30171454f70ac153374b',1,'std::bitset::_Unchecked_reset(size_t __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaf6f4ee325fdf30171454f70ac153374b',1,'_Unchecked_reset()(Global Namespace)']]], + ['_5funchecked_5fset_735',['_Unchecked_set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gab46cfb783c57ffc53976ee861fae1ff4',1,'std::bitset::_Unchecked_set(size_t __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaf6e22292e9928712291bfdfc899e32fe',1,'std::bitset::_Unchecked_set(size_t __pos, int __val) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gab46cfb783c57ffc53976ee861fae1ff4',1,'std::bitset::_Unchecked_set(size_t __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaf6e22292e9928712291bfdfc899e32fe',1,'std::bitset::_Unchecked_set(size_t __pos, int __val) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gab46cfb783c57ffc53976ee861fae1ff4',1,'_Unchecked_set(size_t __pos) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gaf6e22292e9928712291bfdfc899e32fe',1,'_Unchecked_set(size_t __pos, int __val) noexcept(Global Namespace)']]], + ['_5funchecked_5ftest_736',['_Unchecked_test',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga937a54ac511a8847838de564dbe17e39',1,'std::bitset::_Unchecked_test(size_t __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga937a54ac511a8847838de564dbe17e39',1,'std::bitset::_Unchecked_test(size_t __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga937a54ac511a8847838de564dbe17e39',1,'_Unchecked_test()(Global Namespace)']]], + ['_5funqualified_5ftype_737',['_Unqualified_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10575.html',1,'__gnu_cxx']]], + ['_5fvector_5fbase_738',['_Vector_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'std']]], + ['_5fvector_5fbase_3c_20_5f_5fdiff_5ftype_2c_20std_3a_3aallocator_3c_20_5f_5fdiff_5ftype_20_3e_20_3e_739',['_Vector_base< __diff_type, std::allocator< __diff_type > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20_5f_5fgnu_5fparallel_3a_3a_5fpiece_3c_20_5fdifferencetype_20_3e_2c_20std_3a_3aallocator_3c_20_5f_5fgnu_5fparallel_3a_3a_5fpiece_3c_20_5fdifferencetype_20_3e_20_3e_20_3e_740',['_Vector_base< __gnu_parallel::_Piece< _DifferenceType >, std::allocator< __gnu_parallel::_Piece< _DifferenceType > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20_5fcharclasst_2c_20std_3a_3aallocator_3c_20_5fcharclasst_20_3e_20_3e_741',['_Vector_base< _CharClassT, std::allocator< _CharClassT > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20_5fchart_2c_20std_3a_3aallocator_3c_20_5fchart_20_3e_20_3e_742',['_Vector_base< _CharT, std::allocator< _CharT > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20_5fcmpt_2c_20std_3a_3aallocator_3c_20_5fcmpt_20_3e_20_3e_743',['_Vector_base< _Cmpt, std::allocator< _Cmpt > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20_5fnode_20_2a_2c_20_5fnodeptr_5falloc_20_3e_744',['_Vector_base< _Node *, _Nodeptr_Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20_5frealtype_2c_20std_3a_3aallocator_3c_20_5frealtype_20_3e_20_3e_745',['_Vector_base< _RealType, std::allocator< _RealType > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20_5fstate_3c_20_5ftraitst_3a_3achar_5ftype_20_3e_2c_20std_3a_3aallocator_3c_20_5fstate_3c_20_5ftraitst_3a_3achar_5ftype_20_3e_20_3e_20_3e_746',['_Vector_base< _State< _TraitsT::char_type >, std::allocator< _State< _TraitsT::char_type > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20_5fstringt_2c_20std_3a_3aallocator_3c_20_5fstringt_20_3e_20_3e_747',['_Vector_base< _StringT, std::allocator< _StringT > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20block_5ftype_2c_20allocator_5ftype_20_3e_748',['_Vector_base< block_type, allocator_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20catalog_5finfo_20_2a_2c_20std_3a_3aallocator_3c_20catalog_5finfo_20_2a_20_3e_20_3e_749',['_Vector_base< Catalog_info *, std::allocator< Catalog_info * > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20double_2c_20std_3a_3aallocator_3c_20double_20_3e_20_3e_750',['_Vector_base< double, std::allocator< double > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20int_2c_20std_3a_3aallocator_3c_20int_20_3e_20_3e_751',['_Vector_base< int, std::allocator< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20result_5ftype_2c_20std_3a_3aallocator_3c_20result_5ftype_20_3e_20_3e_752',['_Vector_base< result_type, std::allocator< result_type > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20size_5ft_2c_20std_3a_3aallocator_3c_20size_5ft_20_3e_20_3e_753',['_Vector_base< size_t, std::allocator< size_t > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20std_3a_3apair_3c_20_5fbiiter_2c_20int_20_3e_2c_20std_3a_3aallocator_3c_20std_3a_3apair_3c_20_5fbiiter_2c_20int_20_3e_20_3e_20_3e_754',['_Vector_base< std::pair< _BiIter, int >, std::allocator< std::pair< _BiIter, int > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20std_3a_3apair_3c_20_5fstateidt_2c_20std_3a_3avector_20_3e_2c_20std_3a_3aallocator_3c_20std_3a_3apair_3c_20_5fstateidt_2c_20std_3a_3avector_20_3e_20_3e_20_3e_755',['_Vector_base< std::pair< _StateIdT, std::vector >, std::allocator< std::pair< _StateIdT, std::vector > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20std_3a_3apair_3c_20_5fstrtranst_2c_20_5fstrtranst_20_3e_2c_20std_3a_3aallocator_3c_20std_3a_3apair_3c_20_5fstrtranst_2c_20_5fstrtranst_20_3e_20_3e_20_3e_756',['_Vector_base< std::pair< _StrTransT, _StrTransT >, std::allocator< std::pair< _StrTransT, _StrTransT > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_2c_20_5falloc_20_3e_757',['_Vector_base< sub_match< _Bi_iter >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_2c_20allocator_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_20_3e_20_3e_758',['_Vector_base< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fvector_5fbase_3c_20sub_5fmatch_3c_20_5fbiiter_20_3e_2c_20_5falloc_20_3e_759',['_Vector_base< sub_match< _BiIter >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07955.html',1,'']]], + ['_5fweak_5fresult_5ftype_760',['_Weak_result_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06675.html',1,'std']]], + ['_5fweak_5fresult_5ftype_3c_20_5ftp_20_3e_761',['_Weak_result_type< _Tp >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06675.html',1,'']]], + ['_5fweak_5fresult_5ftype_3c_20remove_5fcv_3c_20_5ftp_20_3e_3a_3atype_20_3e_762',['_Weak_result_type< remove_cv< _Tp >::type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06675.html',1,'']]], + ['_5fweak_5fresult_5ftype_5fimpl_763',['_Weak_result_type_impl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06643.html',1,'std']]], + ['_5fweak_5fresult_5ftype_5fimpl_3c_20_5fres_28_2a_29_28_5fargtypes_2e_2e_2e_29_20_5fglibcxx_5fnoexcept_5fqual_20_3e_764',['_Weak_result_type_impl< _Res(*)(_ArgTypes...) _GLIBCXX_NOEXCEPT_QUAL >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06655.html',1,'std']]], + ['_5fweak_5fresult_5ftype_5fimpl_3c_20_5fres_28_2a_29_28_5fargtypes_2e_2e_2e_2e_2e_2e_29_20_5fglibcxx_5fnoexcept_5fqual_20_3e_765',['_Weak_result_type_impl< _Res(*)(_ArgTypes......) _GLIBCXX_NOEXCEPT_QUAL >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06659.html',1,'std']]], + ['_5fweak_5fresult_5ftype_5fimpl_3c_20_5fres_28_5fargtypes_2e_2e_2e_29_20_5fglibcxx_5fnoexcept_5fqual_20_3e_766',['_Weak_result_type_impl< _Res(_ArgTypes...) _GLIBCXX_NOEXCEPT_QUAL >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06647.html',1,'std']]], + ['_5fweak_5fresult_5ftype_5fimpl_3c_20_5fres_28_5fargtypes_2e_2e_2e_2e_2e_2e_29_20_5fglibcxx_5fnoexcept_5fqual_20_3e_767',['_Weak_result_type_impl< _Res(_ArgTypes......) _GLIBCXX_NOEXCEPT_QUAL >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06651.html',1,'std']]], + ['_5fweak_5fresult_5ftype_5fimpl_3c_20remove_5fcv_3c_20_5ffunctor_20_3e_3a_3atype_20_3e_768',['_Weak_result_type_impl< remove_cv< _Functor >::type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06643.html',1,'']]], + ['_5fweak_5fresult_5ftype_5fimpl_3c_20remove_5fcv_3c_20_5ftp_20_3e_3a_3atype_20_3e_769',['_Weak_result_type_impl< remove_cv< _Tp >::type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06643.html',1,'']]], + ['_5fweak_5fresult_5ftype_5fimpl_3c_20remove_5fcv_3c_20remove_5fcv_3c_20_5ftp_20_3e_3a_3atype_20_3e_3a_3atype_20_3e_770',['_Weak_result_type_impl< remove_cv< remove_cv< _Tp >::type >::type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06643.html',1,'']]], + ['_5fwidth_771',['_width',['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#ac1765499d71d87ce0e02c562403eb7d5',1,'NCVMatrix']]], + ['_5fwritefeatures_772',['_writeFeatures',['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga8c315fda8f95f98459daaefd502551b9',1,'cv::_writeFeatures()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga8c315fda8f95f98459daaefd502551b9',1,'_writeFeatures()(Global Namespace)']]] ]; diff --git a/search/all_a.js b/search/all_a.js index f24b7227..44ecd2b1 100644 --- a/search/all_a.js +++ b/search/all_a.js @@ -38,8 +38,8 @@ var searchData= ['abs_5ffunc_3c_20ushort_20_3e_35',['abs_func< ushort >',['https://docs.opencv.org/4.2.0/d6/da7/structcv_1_1cudev_1_1abs__func_3_01ushort_01_4.html',1,'cv::cudev']]], ['abs_5ftype_36',['abs_type',['https://docs.opencv.org/4.2.0/d5/d9e/structcv_1_1V__TypeTraits_3_01double_01_4.html#a8144767807965fe8fcfaecb5af36b0db',1,'cv::V_TypeTraits< double >::abs_type'],['https://docs.opencv.org/4.2.0/da/d19/structcv_1_1V__TypeTraits_3_01float_01_4.html#aa75e91ed5201550adf4830b36b24b39e',1,'cv::V_TypeTraits< float >::abs_type'],['https://docs.opencv.org/4.2.0/db/d59/structcv_1_1V__TypeTraits_3_01int64_01_4.html#aed2ad3edf6993f1552128048d52c7444',1,'cv::V_TypeTraits< int64 >::abs_type'],['https://docs.opencv.org/4.2.0/d0/d9d/structcv_1_1V__TypeTraits_3_01schar_01_4.html#ace0c73791f5b1799e12a37ac728d0edb',1,'cv::V_TypeTraits< schar >::abs_type'],['https://docs.opencv.org/4.2.0/de/dc3/structcv_1_1V__TypeTraits_3_01short_01_4.html#ad162510c4738854ea46bea88b7a343d5',1,'cv::V_TypeTraits< short >::abs_type'],['https://docs.opencv.org/4.2.0/dd/d1d/structcv_1_1V__TypeTraits_3_01uchar_01_4.html#ac4e3a5febc72dc03ee067427a87bd92a',1,'cv::V_TypeTraits< uchar >::abs_type'],['https://docs.opencv.org/4.2.0/d2/d4d/structcv_1_1V__TypeTraits_3_01uint64_01_4.html#ac7d9a5ab8ac3ccc0081f97008c9730a8',1,'cv::V_TypeTraits< uint64 >::abs_type'],['https://docs.opencv.org/4.2.0/d3/d8c/structcv_1_1V__TypeTraits_3_01unsigned_01_4.html#ab894ccfbacf94ab7e97eb3c08735792e',1,'cv::V_TypeTraits< unsigned >::abs_type'],['https://docs.opencv.org/4.2.0/d6/dd5/structcv_1_1V__TypeTraits_3_01ushort_01_4.html#a0aa3378802b0d568b6a4e6ff797691ad',1,'cv::V_TypeTraits< ushort >::abs_type']]], ['absdeterminant_37',['absDeterminant',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ac87c3bf42098d6f7324dafbc50fa83f7',1,'Eigen::ColPivHouseholderQR::absDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ac87c3bf42098d6f7324dafbc50fa83f7',1,'ColPivHouseholderQR< MatrixType >::absDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ac040c34ce3fb2b68d3f57adc0c29d526',1,'Eigen::CompleteOrthogonalDecomposition::absDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a1029e1ccc70bb8669043c5775e7f3b75',1,'Eigen::FullPivHouseholderQR::absDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#aaf4ef26c0b7affc91431ec59c92d64c3',1,'Eigen::HouseholderQR::absDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a3833903fc2bd7252803c969cdbdf45eb',1,'Eigen::SparseLU::absDeterminant()']]], - ['absdiff_38',['absdiff',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6fef31bc8c4071cbc114a758a2b79c14',1,'cv::absdiff()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gac062b283cf46ee90f74a773d3382ab54',1,'cv::cuda::absdiff()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6fef31bc8c4071cbc114a758a2b79c14',1,'absdiff(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gac062b283cf46ee90f74a773d3382ab54',1,'absdiff(InputArray src1, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['absdiff_39',['absDiff',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gaf923b18b9f56f6ecdbb23b380a99a413',1,'cv::gapi::absDiff()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gaf923b18b9f56f6ecdbb23b380a99a413',1,'absDiff()(Global Namespace)']]], + ['absdiff_38',['absDiff',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gaf923b18b9f56f6ecdbb23b380a99a413',1,'cv::gapi::absDiff()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gaf923b18b9f56f6ecdbb23b380a99a413',1,'absDiff()(Global Namespace)']]], + ['absdiff_39',['absdiff',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6fef31bc8c4071cbc114a758a2b79c14',1,'cv::absdiff()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gac062b283cf46ee90f74a773d3382ab54',1,'cv::cuda::absdiff()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6fef31bc8c4071cbc114a758a2b79c14',1,'absdiff(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gac062b283cf46ee90f74a773d3382ab54',1,'absdiff(InputArray src1, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], ['absdiff16s_40',['absdiff16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaba8def02f4712e9034995ed83d53eef0',1,'cv::hal::absdiff16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaba8def02f4712e9034995ed83d53eef0',1,'absdiff16s()(Global Namespace)']]], ['absdiff16u_41',['absdiff16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac9cf83a21446818f75ea3136ce4902f0',1,'cv::hal::absdiff16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac9cf83a21446818f75ea3136ce4902f0',1,'absdiff16u()(Global Namespace)']]], ['absdiff32f_42',['absdiff32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaec553594175dd27343eeb2ed8fa0f597',1,'cv::hal::absdiff32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaec553594175dd27343eeb2ed8fa0f597',1,'absdiff32f()(Global Namespace)']]], @@ -217,12 +217,12 @@ var searchData= ['advanced_20initialization_214',['Advanced initialization',['https://eigen.tuxfamily.org/dox/group__TutorialAdvancedInitialization.html',1,'']]], ['aff_5fthr_5ffast_215',['aff_thr_fast',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a46f3fcb8792636a0f38b970726fed393',1,'cv::tbm::TrackerParams']]], ['aff_5fthr_5fstrong_216',['aff_thr_strong',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a6a9c485ce131d2e3a09793052a19d7ad',1,'cv::tbm::TrackerParams']]], - ['affine_217',['affine',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a9795374292c085bca4d123397d6b37d9',1,'Eigen::Transform::affine()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a761a9c20fd5eefa58ca2f9babdf4c5d8',1,'Eigen::Transform::affine() const']]], - ['affine_218',['Affine',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaee59a86102f150923b0cac6d4ff05107a0872f0a82453aaae40339c33acbb31fb',1,'Eigen::Affine'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaee59a86102f150923b0cac6d4ff05107a0872f0a82453aaae40339c33acbb31fb',1,'Affine(Global Namespace)']]], + ['affine_217',['Affine',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaee59a86102f150923b0cac6d4ff05107a0872f0a82453aaae40339c33acbb31fb',1,'Eigen::Affine'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaee59a86102f150923b0cac6d4ff05107a0872f0a82453aaae40339c33acbb31fb',1,'Affine(Global Namespace)']]], + ['affine_218',['affine',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a9795374292c085bca4d123397d6b37d9',1,'Eigen::Transform::affine()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a761a9c20fd5eefa58ca2f9babdf4c5d8',1,'Eigen::Transform::affine() const']]], ['affine_20transformations_219',['Affine Transformations',['https://docs.opencv.org/4.2.0/d4/d61/tutorial_warp_affine.html',1,'']]], ['affine_2ehpp_220',['affine.hpp',['https://docs.opencv.org/4.2.0/de/d48/affine_8hpp.html',1,'']]], ['affine3_221',['Affine3',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html',1,'cv::Affine3< T >'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a116afdeed21ac6a341033ff38a01b4a2',1,'cv::Affine3::Affine3()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#af63d22662170937a4535f26dc8580023',1,'cv::Affine3::Affine3(const Mat4 &affine)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#abadd37c946a0da674172b0195aa711cf',1,'cv::Affine3::Affine3(const Mat3 &R, const Vec3 &t=Vec3::all(0))'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a51046d0d1857a1a99a19e145321fe9b9',1,'cv::Affine3::Affine3(const Vec3 &rvec, const Vec3 &t=Vec3::all(0))'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a799ec5a3979508b9bb5d201b8c52d066',1,'cv::Affine3::Affine3(const Mat &data, const Vec3 &t=Vec3::all(0))'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ab6a2e02d633e7e2a074451f503320b5f',1,'cv::Affine3::Affine3(const float_type *vals)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a116afdeed21ac6a341033ff38a01b4a2',1,'Affine3< float >::Affine3()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#af63d22662170937a4535f26dc8580023',1,'Affine3< float >::Affine3(const Mat4 &affine)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#abadd37c946a0da674172b0195aa711cf',1,'Affine3< float >::Affine3(const Mat3 &R, const Vec3 &t=Vec3::all(0))'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a51046d0d1857a1a99a19e145321fe9b9',1,'Affine3< float >::Affine3(const Vec3 &rvec, const Vec3 &t=Vec3::all(0))'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a799ec5a3979508b9bb5d201b8c52d066',1,'Affine3< float >::Affine3(const Mat &data, const Vec3 &t=Vec3::all(0))'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#ab6a2e02d633e7e2a074451f503320b5f',1,'Affine3< float >::Affine3(const float_type *vals)']]], - ['affine3_3c_20float_20_3e_222',['Affine3< float >',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html',1,'']]], + ['affine3_3c_20float_20_3e_222',['Affine3< float >',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html',1,'Affine3< float >'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html',1,'cv::Affine3< float >']]], ['affine3d_223',['Affine3d',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga0b49177f52ed1b43e3f5a198baeee203',1,'cv::Affine3d'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga0b49177f52ed1b43e3f5a198baeee203',1,'Affine3d(Global Namespace)']]], ['affine3f_224',['Affine3f',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gae10a81cba3f3232648be48e28759a7bc',1,'cv::Affine3f'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gae10a81cba3f3232648be48e28759a7bc',1,'Affine3f(Global Namespace)']]], ['affinebasedestimator_225',['AffineBasedEstimator',['https://docs.opencv.org/4.2.0/d0/df2/classcv_1_1detail_1_1AffineBasedEstimator.html',1,'cv::detail::AffineBasedEstimator'],['https://docs.opencv.org/4.2.0/d0/df2/classcv_1_1detail_1_1AffineBasedEstimator.html#ac229442349f805d4c21cca70d49963c9',1,'cv::detail::AffineBasedEstimator::AffineBasedEstimator()']]], @@ -257,615 +257,604 @@ var searchData= ['algebra_20and_20decompositions_254',['Linear algebra and decompositions',['https://eigen.tuxfamily.org/dox/group__TutorialLinearAlgebra.html',1,'']]], ['algo_2eh_255',['algo.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00872.html',1,'']]], ['algobase_2eh_256',['algobase.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00875.html',1,'']]], - ['algorithm_257',['Algorithm',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html',1,'cv']]], - ['algorithm_258',['algorithm',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00038.html',1,'']]], - ['algorithm_259',['Algorithm',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a827c8b2781ed17574805f373e6054ff1',1,'cv::Algorithm']]], - ['algorithm_260',['ALGORITHM',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aacc42f38c94fd1898b9e8a14132d94261',1,'ALGORITHM(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aacc42f38c94fd1898b9e8a14132d94261',1,'ALGORITHM(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aacc42f38c94fd1898b9e8a14132d94261',1,'ALGORITHM(Global Namespace)']]], - ['algorithm_261',['Algorithm',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html',1,'Experimental 2D Features Matching Algorithm'],['https://docs.opencv.org/4.2.0/dd/dfc/tutorial_js_grabcut.html',1,'Foreground Extraction using GrabCut Algorithm'],['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'Image Segmentation with Distance Transform and Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d3/db4/tutorial_py_watershed.html',1,'Image Segmentation with Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d7/d1c/tutorial_js_watershed.html',1,'Image Segmentation with Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d8/d83/tutorial_py_grabcut.html',1,'Interactive Foreground Extraction using GrabCut Algorithm']]], - ['algorithm_262',['Training the learning-based white balance algorithm',['https://docs.opencv.org/4.2.0/dc/dcb/tutorial_xphoto_training_white_balance.html',1,'']]], - ['algorithm_20for_20corner_20detection_263',['FAST Algorithm for Corner Detection',['https://docs.opencv.org/4.2.0/df/d0c/tutorial_py_fast.html',1,'']]], - ['algorithm_20to_20the_20facemark_20api_264',['Adding a new algorithm to the Facemark API',['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'']]], - ['algorithm_20with_20g_20api_265',['Implementing a face beautification algorithm with G-API',['https://docs.opencv.org/4.2.0/d4/d48/tutorial_gapi_face_beautification.html',1,'']]], - ['algorithms_266',['Additional photo processing algorithms',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html',1,'']]], - ['algorithms_267',['Algorithms',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01488.html',1,'Algorithms'],['https://docs.opencv.org/4.2.0/d7/d7a/group__xfeatures2d__experiment.html',1,'Experimental 2D Features Algorithms'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html',1,'Non-free 2D Features Algorithms'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html',1,'Optical Flow Algorithms'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html',1,'Optimization Algorithms'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html',1,'Stereo Correspondance Algorithms']]], - ['algorithms_268',['algorithms',['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'STL iterators and algorithms'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'The module brings implementations of different image hashing algorithms.']]], - ['aliasing_269',['Aliasing',['https://eigen.tuxfamily.org/dox/group__TopicAliasing.html',1,'Aliasing'],['https://eigen.tuxfamily.org/dox/TopicLazyEvaluation.html',1,'Lazy Evaluation and Aliasing']]], - ['align_270',['align',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7a0544b4d4e49cb7f4668d8ce7b914d5',1,'std']]], - ['aligned_271',['Aligned',['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1ae12d0f8f869c40c76128260af2242bc8',1,'Eigen::Aligned'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1ae12d0f8f869c40c76128260af2242bc8',1,'Aligned(Global Namespace)']]], - ['aligned_20box_20typedefs_272',['Global aligned box typedefs',['https://eigen.tuxfamily.org/dox/group__alignedboxtypedefs.html',1,'']]], - ['aligned128_273',['Aligned128',['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a60057da2408e499b5656244d0b26cc20',1,'Eigen::Aligned128'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a60057da2408e499b5656244d0b26cc20',1,'Aligned128(Global Namespace)']]], - ['aligned16_274',['Aligned16',['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1ad0b140cd97bc74365b51843d28379655',1,'Eigen::Aligned16'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1ad0b140cd97bc74365b51843d28379655',1,'Aligned16(Global Namespace)']]], - ['aligned32_275',['Aligned32',['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a8a380b1cd0c3e5a6cceac06f8235157a',1,'Eigen::Aligned32'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a8a380b1cd0c3e5a6cceac06f8235157a',1,'Aligned32(Global Namespace)']]], - ['aligned64_276',['Aligned64',['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a2639cfa1e8faac751556bc0009fe95a4',1,'Eigen::Aligned64'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a2639cfa1e8faac751556bc0009fe95a4',1,'Aligned64(Global Namespace)']]], - ['aligned8_277',['Aligned8',['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a9d99d7a9ff1da5c949bec22733bfba14',1,'Eigen::Aligned8'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a9d99d7a9ff1da5c949bec22733bfba14',1,'Aligned8(Global Namespace)']]], - ['aligned_5fallocator_278',['aligned_allocator',['https://eigen.tuxfamily.org/dox/classEigen_1_1aligned__allocator.html',1,'Eigen']]], - ['aligned_5fbuffer_2eh_279',['aligned_buffer.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01025.html',1,'']]], - ['aligned_5fstorage_280',['aligned_storage',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04195.html',1,'std']]], - ['aligned_5fstorage_3c_20sizeof_28_5fm_5fptr_29_2c_20alignof_28void_20_2a_29_3e_281',['aligned_storage< sizeof(_M_ptr), alignof(void *)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04195.html',1,'']]], - ['aligned_5fstorage_3c_20sizeof_28_5fres_29_2c_20_5f_5falignof_5f_5f_28_5fres_29_3e_282',['aligned_storage< sizeof(_Res), __alignof__(_Res)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04195.html',1,'']]], - ['aligned_5fstorage_3c_20sizeof_28_5ftp_29_2c_20_5f_5falignof_5f_5f_28_5ftp_29_3e_283',['aligned_storage< sizeof(_Tp), __alignof__(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04195.html',1,'']]], - ['aligned_5fstorage_3c_20sizeof_28_5ftp_29_2c_20alignof_28_5ftp_29_3e_284',['aligned_storage< sizeof(_Tp), alignof(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04195.html',1,'']]], - ['aligned_5fstorage_3c_20sizeof_28_5fvalue_29_2c_20_5f_5falignof_5f_5f_28_5fvalue_29_3e_285',['aligned_storage< sizeof(_Value), __alignof__(_Value)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04195.html',1,'']]], - ['aligned_5fstorage_5ft_286',['aligned_storage_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga333ed0641a23a64d26590875fab8bd64',1,'std::aligned_storage_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga333ed0641a23a64d26590875fab8bd64',1,'aligned_storage_t(Global Namespace)']]], - ['aligned_5funion_287',['aligned_union',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04211.html',1,'std']]], - ['alignedbit_288',['AlignedBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gab1088154b1bb147229211e4f3b56d401',1,'Eigen::AlignedBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gab1088154b1bb147229211e4f3b56d401',1,'AlignedBit(Global Namespace)']]], - ['alignedbox_289',['AlignedBox',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html',1,'Eigen::AlignedBox< class, _AmbientDim >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a43aba4c646424355dd39864655a3386f',1,'Eigen::AlignedBox::AlignedBox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a05f7ca06a060c8d4d2e910870669538c',1,'Eigen::AlignedBox::AlignedBox(const AlignedBox< OtherScalarType, AmbientDimAtCompileTime > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a77f5058435889bf0dfe84bdbd158f10b',1,'Eigen::AlignedBox::AlignedBox(const MatrixBase< Derived > &p)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#abbda47b393f17094998da5cdcb73df28',1,'Eigen::AlignedBox::AlignedBox(const OtherVectorType1 &_min, const OtherVectorType2 &_max)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ade9f3bc760956c19d9c087b3a9cd6389',1,'Eigen::AlignedBox::AlignedBox(Index _dim)']]], - ['alignedscaling2d_290',['AlignedScaling2d',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af8975289b8134a5021e806029516e82c',1,'Eigen']]], - ['alignedscaling2f_291',['AlignedScaling2f',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af2440178a1f5f6abef6ee0231bc49184',1,'Eigen']]], - ['alignedscaling3d_292',['AlignedScaling3d',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a0aff001d5740f13797c9acd4e3276673',1,'Eigen']]], - ['alignedscaling3f_293',['AlignedScaling3f',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a45caf8b0e6da378885f4ae3f06c5cde3',1,'Eigen']]], - ['alignexposures_294',['AlignExposures',['https://docs.opencv.org/4.2.0/d4/df2/classcv_1_1AlignExposures.html',1,'cv']]], - ['alignment_295',['alignment',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#a22bbeb73256c4b87069e4fccc217924e',1,'INCVMemAllocator::alignment()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#a94fe530e7467669889e68815a4d0f35f',1,'NCVMemNativeAllocator::alignment()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#af15faac5f28b4dd4951a99a1f0253ace',1,'NCVMemStackAllocator::alignment()'],['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'Compiler making a wrong assumption on stack alignment']]], - ['alignment_20issues_296',['Alignment issues',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__Alignement.html',1,'']]], - ['alignment_5fof_297',['alignment_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03871.html',1,'std']]], - ['alignment_5fvalue_298',['alignment_value',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga02d39c3e7eff3fb5ccdf9878ebfad0ef',1,'std::aligned_union::alignment_value'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga02d39c3e7eff3fb5ccdf9878ebfad0ef',1,'alignment_value(Global Namespace)']]], - ['alignmenttype_299',['AlignmentType',['https://eigen.tuxfamily.org/dox/group__enums.html#ga45fe06e29902b7a2773de05ba27b47a1',1,'Eigen::AlignmentType'],['https://eigen.tuxfamily.org/dox/group__enums.html#ga45fe06e29902b7a2773de05ba27b47a1',1,'AlignmentType(Global Namespace)']]], - ['alignmtb_300',['AlignMTB',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html',1,'cv']]], - ['alignptr_301',['alignPtr',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga138b3f05c8a26bc74038142b4367cc31',1,'cv::alignPtr()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga138b3f05c8a26bc74038142b4367cc31',1,'alignPtr()(Global Namespace)']]], - ['alignsize_302',['alignSize',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf2ff8f837e7a44f288b050765492f800',1,'cv::alignSize()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf2ff8f837e7a44f288b050765492f800',1,'alignSize(size_t sz, int n)(Global Namespace)']]], - ['alignup_303',['alignUp',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga2276f3c6846b8eea554dea05a4f39664',1,]]], - ['all_304',['all',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#ad2ddc152ed732bc16528984b71f1066d',1,'std::locale::all'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'cv::Matx::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< _Tp, cn, 1 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, 1, 3 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, 2, 2 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, 2, 3 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, 3, 3 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, 3, 4 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, 4, 4 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, cn, 1 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< float, 2, 3 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< float, 3, 3 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< float, cn, 1 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< float_type, 4, 4 >::all()'],['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#af5a0207f6f98a69077db8e77898abc0f',1,'cv::Range::all()'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#a2180785ecd8ffae4e9b67b81d64b4662',1,'cv::gapi::own::Scalar::all()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ac1509a4b8454fe7fe29db069e13a2e6f',1,'cv::Scalar_::all()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ac1509a4b8454fe7fe29db069e13a2e6f',1,'Scalar_< double >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'cv::Vec::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< _Tp, 4 >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< double, 2 >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< double, 3 >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< double, 4 >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< double, nFeatures >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< float, 2 >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< float, 3 >::all()'],['https://docs.opencv.org/4.2.0/dc/df8/structcv_1_1cudev_1_1VecTraits_3_01char1_01_4.html#a4578bc33d69ea3d130310d48875fc526',1,'cv::cudev::VecTraits< char1 >::all()'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1cudev_1_1VecTraits_3_01char2_01_4.html#a9885d810ad93ba9e8d545620377b94b5',1,'cv::cudev::VecTraits< char2 >::all()'],['https://docs.opencv.org/4.2.0/df/de4/structcv_1_1cudev_1_1VecTraits_3_01char3_01_4.html#aff3f7d757d5e109d83d338d249c50523',1,'cv::cudev::VecTraits< char3 >::all()'],['https://docs.opencv.org/4.2.0/dc/df6/structcv_1_1cudev_1_1VecTraits_3_01char4_01_4.html#adfffd96f3d074ba2741bc8b58864743b',1,'cv::cudev::VecTraits< char4 >::all()'],['https://docs.opencv.org/4.2.0/d1/d4e/structcv_1_1cudev_1_1VecTraits_3_01double_01_4.html#aacbc12f1935139202d7558a505c79ac0',1,'cv::cudev::VecTraits< double >::all()'],['https://docs.opencv.org/4.2.0/d1/de1/structcv_1_1cudev_1_1VecTraits_3_01double1_01_4.html#ad460720fd3156df9967df2536bb29e16',1,'cv::cudev::VecTraits< double1 >::all()'],['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1VecTraits_3_01double2_01_4.html#ae77c7a246b5a30f675053fb0d4b123eb',1,'cv::cudev::VecTraits< double2 >::all()'],['https://docs.opencv.org/4.2.0/d5/d24/structcv_1_1cudev_1_1VecTraits_3_01double3_01_4.html#a79aebc1e2d78351253564bcd431faef6',1,'cv::cudev::VecTraits< double3 >::all()'],['https://docs.opencv.org/4.2.0/d1/d5d/structcv_1_1cudev_1_1VecTraits_3_01double4_01_4.html#a76faae25f6e04d64ca7e60ac737b1847',1,'cv::cudev::VecTraits< double4 >::all()'],['https://docs.opencv.org/4.2.0/d0/d48/structcv_1_1cudev_1_1VecTraits_3_01float_01_4.html#a7f07898f6180edf224bdb4686eabb52c',1,'cv::cudev::VecTraits< float >::all()'],['https://docs.opencv.org/4.2.0/dc/d22/structcv_1_1cudev_1_1VecTraits_3_01float1_01_4.html#abca766fc324aadc390d2e4712e685410',1,'cv::cudev::VecTraits< float1 >::all()'],['https://docs.opencv.org/4.2.0/d9/dfe/structcv_1_1cudev_1_1VecTraits_3_01float2_01_4.html#abd109bd23ad2ee9d75517a40954e1f97',1,'cv::cudev::VecTraits< float2 >::all()'],['https://docs.opencv.org/4.2.0/d9/d1a/structcv_1_1cudev_1_1VecTraits_3_01float3_01_4.html#abb8882b314dda3059e20918499623dbe',1,'cv::cudev::VecTraits< float3 >::all()'],['https://docs.opencv.org/4.2.0/d9/d9c/structcv_1_1cudev_1_1VecTraits_3_01float4_01_4.html#a162d2b4e1a5b5c4133355045fbc139ea',1,'cv::cudev::VecTraits< float4 >::all()'],['https://docs.opencv.org/4.2.0/d7/dc2/structcv_1_1cudev_1_1VecTraits_3_01int1_01_4.html#ae6889183c06b6c14bdc7226e2797eeb9',1,'cv::cudev::VecTraits< int1 >::all()'],['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1VecTraits_3_01int2_01_4.html#a8bb81f3e32b5c2e354cb79b679035d0b',1,'cv::cudev::VecTraits< int2 >::all()'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1VecTraits_3_01int3_01_4.html#aff4fbacb92cfd1c6d6688f02249b66ad',1,'cv::cudev::VecTraits< int3 >::all()'],['https://docs.opencv.org/4.2.0/da/d75/structcv_1_1cudev_1_1VecTraits_3_01int4_01_4.html#a951b1abed95359992723844f2b028708',1,'cv::cudev::VecTraits< int4 >::all()'],['https://docs.opencv.org/4.2.0/d4/d43/structcv_1_1cudev_1_1VecTraits_3_01schar_01_4.html#aa075b3508fe7f4b282335628a47f1feb',1,'cv::cudev::VecTraits< schar >::all()'],['https://docs.opencv.org/4.2.0/da/df0/structcv_1_1cudev_1_1VecTraits_3_01short_01_4.html#a64af111068a8e1d7238730a4bb373d91',1,'cv::cudev::VecTraits< short >::all()'],['https://docs.opencv.org/4.2.0/d6/dec/structcv_1_1cudev_1_1VecTraits_3_01short1_01_4.html#a92ef99b52d2ef23128d227a8c6bae6d7',1,'cv::cudev::VecTraits< short1 >::all()'],['https://docs.opencv.org/4.2.0/dd/d78/structcv_1_1cudev_1_1VecTraits_3_01short2_01_4.html#a0257404018eced54da612eb8502d3a1e',1,'cv::cudev::VecTraits< short2 >::all()'],['https://docs.opencv.org/4.2.0/da/d6d/structcv_1_1cudev_1_1VecTraits_3_01short3_01_4.html#afd25f0d73679d780d4a28c46adf6843d',1,'cv::cudev::VecTraits< short3 >::all()'],['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1VecTraits_3_01short4_01_4.html#a674ed3369b1e709ee228cd4624e250bb',1,'cv::cudev::VecTraits< short4 >::all()'],['https://docs.opencv.org/4.2.0/df/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar_01_4.html#affc0692bcc1ba6040895264c611c6dfc',1,'cv::cudev::VecTraits< uchar >::all()'],['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar1_01_4.html#ab591bf25d8d2b025b82f86da4cb3e856',1,'cv::cudev::VecTraits< uchar1 >::all()'],['https://docs.opencv.org/4.2.0/d0/da8/structcv_1_1cudev_1_1VecTraits_3_01uchar2_01_4.html#a1e1f2afe6614057a9d47f8d03f8eeabb',1,'cv::cudev::VecTraits< uchar2 >::all()'],['https://docs.opencv.org/4.2.0/da/d8a/structcv_1_1cudev_1_1VecTraits_3_01uchar3_01_4.html#a790bce11b0ef688f8790dfff27344e13',1,'cv::cudev::VecTraits< uchar3 >::all()'],['https://docs.opencv.org/4.2.0/d4/dc1/structcv_1_1cudev_1_1VecTraits_3_01uchar4_01_4.html#afb83b8eb0beda15d3a5f7cf6aaa4e27b',1,'cv::cudev::VecTraits< uchar4 >::all()'],['https://docs.opencv.org/4.2.0/de/d87/structcv_1_1cudev_1_1VecTraits_3_01uint_01_4.html#a84fb06944258033a3a04c1cd52a392d9',1,'cv::cudev::VecTraits< uint >::all()'],['https://docs.opencv.org/4.2.0/de/d41/structcv_1_1cudev_1_1VecTraits_3_01uint1_01_4.html#a6299d51c5215c26bd4277ed7a341ee27',1,'cv::cudev::VecTraits< uint1 >::all()'],['https://docs.opencv.org/4.2.0/d7/d19/structcv_1_1cudev_1_1VecTraits_3_01uint2_01_4.html#ab18dfb18808e464a20376fd8e6f40cdf',1,'cv::cudev::VecTraits< uint2 >::all()'],['https://docs.opencv.org/4.2.0/da/d00/structcv_1_1cudev_1_1VecTraits_3_01uint3_01_4.html#a13be20b30a144422a4553c74a1641e5c',1,'cv::cudev::VecTraits< uint3 >::all()'],['https://docs.opencv.org/4.2.0/dc/d7c/structcv_1_1cudev_1_1VecTraits_3_01uint4_01_4.html#adcbbade6526b4b9c656fbdb8e1ee405d',1,'cv::cudev::VecTraits< uint4 >::all()'],['https://docs.opencv.org/4.2.0/d9/db8/structcv_1_1cudev_1_1VecTraits_3_01ushort_01_4.html#a61b42ec7a21f760aef2b3006fb355c41',1,'cv::cudev::VecTraits< ushort >::all()'],['https://docs.opencv.org/4.2.0/da/d76/structcv_1_1cudev_1_1VecTraits_3_01ushort1_01_4.html#afa51d96bbde6bb179782cd7d9a41af6c',1,'cv::cudev::VecTraits< ushort1 >::all()'],['https://docs.opencv.org/4.2.0/d0/d40/structcv_1_1cudev_1_1VecTraits_3_01ushort2_01_4.html#a3cd2ea69878c615686526f092b7efbf1',1,'cv::cudev::VecTraits< ushort2 >::all()'],['https://docs.opencv.org/4.2.0/d4/dd7/structcv_1_1cudev_1_1VecTraits_3_01ushort3_01_4.html#a3bd8aa9d7c7abd02d6ccfa48cdf38567',1,'cv::cudev::VecTraits< ushort3 >::all()'],['https://docs.opencv.org/4.2.0/d3/d14/structcv_1_1cudev_1_1VecTraits_3_01ushort4_01_4.html#aa70e62cd84c3e5e3448ae64e575e206a',1,'cv::cudev::VecTraits< ushort4 >::all()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a19aaf012161f62da7b7c26fe03aafe79',1,'std::bitset::all()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#afc6c0cbe1e68203c79c039c3c38e8c3e',1,'std::tr2::dynamic_bitset::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae42ab60296c120e9f45ce3b44e1761a4',1,'Eigen::DenseBase::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae42ab60296c120e9f45ce3b44e1761a4',1,'DenseBase< ArrayWrapper< ExpressionType > >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae42ab60296c120e9f45ce3b44e1761a4',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae42ab60296c120e9f45ce3b44e1761a4',1,'DenseBase< Solve< Decomposition, RhsType > >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'Eigen::VectorwiseOp::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const Derived, Horizontal >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const Derived, Vertical >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::all()'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html#ga790ab6c4226ef5f678b9eb532a3eab14',1,'Eigen::all'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html#ga790ab6c4226ef5f678b9eb532a3eab14',1,'all(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145aa181a603769c1f98ad927e7367c7aa51',1,'all(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145aa181a603769c1f98ad927e7367c7aa51',1,'all(Global Namespace)']]], - ['all_5findices_2eh_305',['all_indices.h',['https://docs.opencv.org/4.2.0/d0/deb/all__indices_8h.html',1,'']]], - ['all_5flayers_2ehpp_306',['all_layers.hpp',['https://docs.opencv.org/4.2.0/dd/d6b/all__layers_8hpp.html',1,'']]], - ['all_5fof_307',['all_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaaef2d0f2f0d6942636f6f42eb940b850',1,'std::all_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaaef2d0f2f0d6942636f6f42eb940b850',1,'all_of()(Global Namespace)']]], - ['allfinite_308',['allFinite',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1e669fd3aaae50a4870dc1b8f3b8884',1,'Eigen::DenseBase::allFinite()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1e669fd3aaae50a4870dc1b8f3b8884',1,'DenseBase< ArrayWrapper< ExpressionType > >::allFinite()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1e669fd3aaae50a4870dc1b8f3b8884',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::allFinite()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1e669fd3aaae50a4870dc1b8f3b8884',1,'DenseBase< Solve< Decomposition, RhsType > >::allFinite()']]], - ['alloc_309',['alloc',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#a4b1432cac3a276d4ae3e98cce84484ca',1,'INCVMemAllocator::alloc()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#a5f9fc6b038d5358d70ee45c4877e1e65',1,'NCVMemNativeAllocator::alloc()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#a657183cac71dc8437d78b167e4a884e6',1,'NCVMemStackAllocator::alloc()']]], - ['alloc_5ftype_310',['alloc_type',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#adafb6e996e9e7a0d6c4696b6a186600e',1,'cv::cuda::HostMem']]], - ['allocate_311',['allocate',['https://docs.opencv.org/4.2.0/df/d98/classcv_1_1cuda_1_1GpuMat_1_1Allocator.html#aaae55175c4bcd6485928b68dde3f2730',1,'cv::cuda::GpuMat::Allocator::allocate()'],['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a9b8f24e0dae966eb6ba996ff0dba2a19',1,'cv::Allocator::allocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a1c16dbf31a16748ffc930e796f0dc54b',1,'cv::AutoBuffer::allocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a1c16dbf31a16748ffc930e796f0dc54b',1,'AutoBuffer< double, 1 >::allocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a1c16dbf31a16748ffc930e796f0dc54b',1,'AutoBuffer< int64, 1 >::allocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a1c16dbf31a16748ffc930e796f0dc54b',1,'AutoBuffer< String, 1 >::allocate()'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#aa45256af121fb6573c665adb113b68b8',1,'cv::MatAllocator::allocate(int dims, const int *sizes, int type, void *data, size_t *step, AccessFlag flags, UMatUsageFlags usageFlags) const=0'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#acffc4f4d2141b44aff63cc136d79e494',1,'cv::MatAllocator::allocate(UMatData *data, AccessFlag accessflags, UMatUsageFlags usageFlags) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#affb80bd4db40e98a88dfef90fca171f0',1,'__alloc_traits< _Tp_alloc_type >::allocate(_Tp_alloc_type &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a197382ef13610c2b6aa052659de425e7',1,'__alloc_traits< _Tp_alloc_type >::allocate(_Tp_alloc_type &__a, size_type __n, const_void_pointer __hint)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#affb80bd4db40e98a88dfef90fca171f0',1,'__alloc_traits< _Tp_alloc_type >::allocate(_Tp_alloc_type &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a197382ef13610c2b6aa052659de425e7',1,'__alloc_traits< _Tp_alloc_type >::allocate(_Tp_alloc_type &__a, size_type __n, const_void_pointer __hint)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#affb80bd4db40e98a88dfef90fca171f0',1,'__gnu_cxx::__alloc_traits::allocate(_Alloc &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a197382ef13610c2b6aa052659de425e7',1,'__gnu_cxx::__alloc_traits::allocate(_Alloc &__a, size_type __n, const_void_pointer __hint)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#affb80bd4db40e98a88dfef90fca171f0',1,'__gnu_cxx::__alloc_traits::allocate(_Alloc &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a197382ef13610c2b6aa052659de425e7',1,'__gnu_cxx::__alloc_traits::allocate(_Alloc &__a, size_type __n, const_void_pointer __hint)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#affb80bd4db40e98a88dfef90fca171f0',1,'allocator_traits< _Tp_alloc_type >::allocate(_Tp_alloc_type &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a197382ef13610c2b6aa052659de425e7',1,'allocator_traits< _Tp_alloc_type >::allocate(_Tp_alloc_type &__a, size_type __n, const_void_pointer __hint)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#affb80bd4db40e98a88dfef90fca171f0',1,'std::allocator_traits::allocate(_Alloc &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a197382ef13610c2b6aa052659de425e7',1,'std::allocator_traits::allocate(_Alloc &__a, size_type __n, const_void_pointer __hint)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a2fc200b5597fdfa4f0c65d1198cfbbe0',1,'std::allocator_traits< allocator< _Tp > >::allocate(allocator_type &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a2c50858a50201af5dcb94c660d3f426b',1,'std::allocator_traits< allocator< _Tp > >::allocate(allocator_type &__a, size_type __n, const_void_pointer __hint)']]], - ['allocate_5fshared_312',['allocate_shared',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< _Dir >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< _Dir_stack >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< _RegexT >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< _State >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< _State_base >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< _State_type >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< std::mutex >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'std::shared_ptr::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga84894e14d771a93b933577b3f8f191cc',1,'std::allocate_shared()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga84894e14d771a93b933577b3f8f191cc',1,'allocate_shared(const _Alloc &__a, _Args &&... __args)(Global Namespace)']]], - ['allocated_5fptr_2eh_313',['allocated_ptr.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00269.html',1,'']]], - ['allocator_314',['Allocator',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html',1,'cv::Allocator< class >'],['https://docs.opencv.org/4.2.0/df/d98/classcv_1_1cuda_1_1GpuMat_1_1Allocator.html',1,'cv::cuda::GpuMat::Allocator']]], - ['allocator_315',['allocator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04767.html',1,'std']]], - ['allocator_316',['Allocator',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#aafdbd199d4af478deaf145db3ecf40b9',1,'cv::Allocator::Allocator()'],['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a46bfa8003a58d0938831392cb4e257b8',1,'cv::Allocator::Allocator(Allocator const &)'],['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a39bfd5315c0572eb6e89bb62177f439e',1,'cv::Allocator::Allocator(Allocator< U > const &)']]], - ['allocator_317',['allocator',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a1dc1f7a23c89d2a36f0efc7db1b0d5a4',1,'cv::cuda::GpuMat::allocator'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a4d2eb7a536cd5a0f18808b6112111d6a',1,'cv::Mat::allocator'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a1fb3a925c15a454a5edba1cb0f0008fd',1,'cv::UMat::allocator']]], - ['allocator_2eh_318',['allocator.h',['https://docs.opencv.org/4.2.0/da/da9/allocator_8h.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00272.html',1,'(Global Namespace)']]], - ['allocator_3c_20value_5ftype_20_3e_319',['allocator< value_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04767.html',1,'']]], - ['allocator_3c_20void_20_3e_320',['allocator< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04759.html',1,'std']]], - ['allocator_5farg_5ft_321',['allocator_arg_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08063.html',1,'std']]], - ['allocator_5fstats_2ehpp_322',['allocator_stats.hpp',['https://docs.opencv.org/4.2.0/de/da8/allocator__stats_8hpp.html',1,'']]], - ['allocator_5ftraits_323',['allocator_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html',1,'std']]], - ['allocator_5ftraits_3c_20_5ftp_5falloc_5ftype_20_3e_324',['allocator_traits< _Tp_alloc_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html',1,'']]], - ['allocator_5ftraits_3c_20allocator_3c_20_5ftp_20_3e_20_3e_325',['allocator_traits< allocator< _Tp > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html',1,'std']]], - ['allocator_5ftype_326',['allocator_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#a9daab8bbfe3a02a6241b4e0a7354d3f9',1,'__gnu_pbds::trie_prefix_search_node_update::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#afca1125c7f138bdffa1fda17a5181429',1,'allocator_traits< _Tp_alloc_type >::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#afca1125c7f138bdffa1fda17a5181429',1,'std::allocator_traits::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a235dca414a6b10eb9434eb7bba492c5e',1,'std::allocator_traits< allocator< _Tp > >::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3cfe51976315c0c1fbe62ac14c98e1f7',1,'std::set::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3cfe51976315c0c1fbe62ac14c98e1f7',1,'std::set::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a434ca8d37d3262f336f06903abbd170b',1,'std::unordered_map::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a434ca8d37d3262f336f06903abbd170b',1,'std::unordered_map::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aab5213cbfd6797faef226b949240b8ec',1,'std::unordered_multimap::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aab5213cbfd6797faef226b949240b8ec',1,'std::unordered_multimap::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a37fd3cf11429a513cea1f132c06e87df',1,'std::unordered_multiset::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a37fd3cf11429a513cea1f132c06e87df',1,'std::unordered_multiset::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a9bba281b4f65b14513a532e398d37642',1,'std::unordered_set::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a9bba281b4f65b14513a532e398d37642',1,'std::unordered_set::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a434ca8d37d3262f336f06903abbd170b',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a434ca8d37d3262f336f06903abbd170b',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::allocator_type'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad38ae80f1e99d4b1f33c99fea4611457.html#ad38ae80f1e99d4b1f33c99fea4611457',1,'nlohmann::basic_json::allocator_type']]], - ['allocatorflags_5f_327',['allocatorFlags_',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a398a4153df8d1af5fd5a26996d1b4684',1,'cv::UMatData']]], - ['allocators_328',['Allocators',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01499.html',1,'']]], - ['allocatorstatisticsinterface_329',['AllocatorStatisticsInterface',['https://docs.opencv.org/4.2.0/df/d6f/classcv_1_1utils_1_1AllocatorStatisticsInterface.html',1,'cv::utils::AllocatorStatisticsInterface'],['https://docs.opencv.org/4.2.0/df/d6f/classcv_1_1utils_1_1AllocatorStatisticsInterface.html#a9ee754891f9a2124a947d9de238b414b',1,'cv::utils::AllocatorStatisticsInterface::AllocatorStatisticsInterface()']]], - ['alloctype_330',['AllocType',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#aa0d69b2aa95680a6b2af6dc4dda44e16',1,'cv::cuda::HostMem']]], - ['almostequal_331',['almostEqual',['../namespaceutil.html#a59535c29b1922ba23f28bdd79857da8e',1,'util']]], - ['alpha_332',['alpha',['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html#aff241ba0858b3f99e24204e66f2db61b',1,'cv::gapi::wip::draw::Image::alpha'],['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#af6eb8d2f7b89b29e7db7e06e87933702',1,'cv::dnn::LRNLayer::alpha'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad15093b928c0af84cc1e88179ef4d638',1,'cv::MatExpr::alpha'],['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#a2ee61847b904d29e7b74b9ceac701bd2',1,'NCVBroxOpticalFlowDescriptor::alpha'],['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html#a37db0abb88725d4ea0f1d3dceadec3ea',1,'cv::TrackerSamplerPF::Params::alpha'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a580ada1c13cd18bcf218674f6d606c39',1,'cv::ppf_match_3d::Pose3D::alpha'],['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a306263e21a28caced1bad68eed80a73e',1,'cv::tracking::UnscentedKalmanFilterParams::alpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a885140ca6e119c2c66130bcdd388038c',1,'gamma_distribution< double >::alpha()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a885140ca6e119c2c66130bcdd388038c',1,'gamma_distribution< result_type >::alpha()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a885140ca6e119c2c66130bcdd388038c',1,'std::gamma_distribution::alpha()']]], - ['alpha1_333',['alpha1',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#a6a2d268e500d32574ed00ff4da454f07',1,'cv::cuda::FGDParams']]], - ['alpha2_334',['alpha2',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#abaf4902f6c9be62f8580e7800242019d',1,'cv::cuda::FGDParams']]], - ['alpha3_335',['alpha3',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#a8d81aaed6cc97471c18946dd152a1e06',1,'cv::cuda::FGDParams']]], - ['alpha_5fatop_336',['ALPHA_ATOP',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a772a10e83016004a48a40abf5303f396',1,'cv::cuda::ALPHA_ATOP'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a772a10e83016004a48a40abf5303f396',1,'ALPHA_ATOP(Global Namespace)']]], - ['alpha_5fatop_5fpremul_337',['ALPHA_ATOP_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694aa583c173fb8c3c0d97a2b18d7a474d40',1,'cv::cuda::ALPHA_ATOP_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694aa583c173fb8c3c0d97a2b18d7a474d40',1,'ALPHA_ATOP_PREMUL(Global Namespace)']]], - ['alpha_5fin_338',['ALPHA_IN',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a715019460703f11c2ad2fce0f699651d',1,'cv::cuda::ALPHA_IN'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a715019460703f11c2ad2fce0f699651d',1,'ALPHA_IN(Global Namespace)']]], - ['alpha_5fin_5fpremul_339',['ALPHA_IN_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a9c80438eea06fc1e3d1c36dd89afad4a',1,'cv::cuda::ALPHA_IN_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a9c80438eea06fc1e3d1c36dd89afad4a',1,'ALPHA_IN_PREMUL(Global Namespace)']]], - ['alpha_5fout_340',['ALPHA_OUT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a4b058f82e5da6ff6c6fc064b622e939e',1,'cv::cuda::ALPHA_OUT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a4b058f82e5da6ff6c6fc064b622e939e',1,'ALPHA_OUT(Global Namespace)']]], - ['alpha_5fout_5fpremul_341',['ALPHA_OUT_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a5e4b7e0bff18cf3d22484caf1e5a57d2',1,'cv::cuda::ALPHA_OUT_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a5e4b7e0bff18cf3d22484caf1e5a57d2',1,'ALPHA_OUT_PREMUL(Global Namespace)']]], - ['alpha_5fover_342',['ALPHA_OVER',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a5d7ef7ce41890165b48db13c4b07b800',1,'cv::cuda::ALPHA_OVER'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a5d7ef7ce41890165b48db13c4b07b800',1,'ALPHA_OVER(Global Namespace)']]], - ['alpha_5fover_5fpremul_343',['ALPHA_OVER_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a42038364eec729063da1129f91da7ae8',1,'cv::cuda::ALPHA_OVER_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a42038364eec729063da1129f91da7ae8',1,'ALPHA_OVER_PREMUL(Global Namespace)']]], - ['alpha_5fplus_344',['ALPHA_PLUS',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694af8c43ced61d1ac7235d1b0a3e37d8127',1,'cv::cuda::ALPHA_PLUS'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694af8c43ced61d1ac7235d1b0a3e37d8127',1,'ALPHA_PLUS(Global Namespace)']]], - ['alpha_5fplus_5fpremul_345',['ALPHA_PLUS_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a48edec2d9e068d4727c917bbe240c714',1,'cv::cuda::ALPHA_PLUS_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a48edec2d9e068d4727c917bbe240c714',1,'ALPHA_PLUS_PREMUL(Global Namespace)']]], - ['alpha_5fpremul_346',['ALPHA_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a58f446076264b432bd4dbf90eeac74d2',1,'cv::cuda::ALPHA_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a58f446076264b432bd4dbf90eeac74d2',1,'ALPHA_PREMUL(Global Namespace)']]], - ['alpha_5fxor_347',['ALPHA_XOR',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a5f2df452a2f9ecf4153d8f2ff0cdf18b',1,'cv::cuda::ALPHA_XOR'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a5f2df452a2f9ecf4153d8f2ff0cdf18b',1,'ALPHA_XOR(Global Namespace)']]], - ['alpha_5fxor_5fpremul_348',['ALPHA_XOR_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694afba1dd6df9231630810091dba1ba1c9a',1,'cv::cuda::ALPHA_XOR_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694afba1dd6df9231630810091dba1ba1c9a',1,'ALPHA_XOR_PREMUL(Global Namespace)']]], - ['alphacomp_349',['alphaComp',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga08a698700458d9311390997b57fbf8dc',1,'cv::cuda::alphaComp()'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga08a698700458d9311390997b57fbf8dc',1,'alphaComp()(Global Namespace)']]], - ['alphacomptypes_350',['AlphaCompTypes',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga320de8db3b0d8624e9b92fc6b117b694',1,'cv::cuda::AlphaCompTypes'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga320de8db3b0d8624e9b92fc6b117b694',1,'AlphaCompTypes(Global Namespace)']]], - ['alphas_351',['alphas',['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#a82b1bc41267f46e5c5899d5b084a73bb',1,'Eigen::GeneralizedEigenSolver']]], - ['alt_352',['ALT',['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#aaee8f2a3f0f04415acca5f1ada1ce8edafd9ab1f5c695ae44e49a8a932431dc61',1,'cv::viz::KeyboardEvent']]], - ['always_5fadjustor_353',['always_adjustor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10699.html',1,'__gnu_cxx::limit_condition::always_adjustor'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10723.html',1,'__gnu_cxx::random_condition::always_adjustor']]], - ['am_5ffilter_354',['AM_FILTER',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50baf5dab3b48abd1fff2316a98a3f1f03b3',1,'cv::ximgproc::AM_FILTER'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50baf5dab3b48abd1fff2316a98a3f1f03b3',1,'AM_FILTER(Global Namespace)']]], - ['amacrincellstemporalcutfrequency_355',['amacrinCellsTemporalCutFrequency',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#ad50ef2a35801eb5e0b2d7ad9e20c33f3',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters']]], - ['ambient_356',['AMBIENT',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acac8a6d0b96e27a89f2b240c0c867a44d7',1,'cv::viz::AMBIENT'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acac8a6d0b96e27a89f2b240c0c867a44d7',1,'AMBIENT(Global Namespace)']]], - ['amdordering_357',['AMDOrdering',['https://eigen.tuxfamily.org/dox/classEigen_1_1AMDOrdering.html',1,'Eigen']]], - ['amethyst_358',['amethyst',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a980cc0325d5b14936fff7abe3c47054f',1,'cv::viz::Color']]], - ['amfilter_359',['amFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaa64a0d71e930e75b2a174e9acc38c37b',1,'cv::ximgproc::amFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaa64a0d71e930e75b2a174e9acc38c37b',1,'amFilter(InputArray joint, InputArray src, OutputArray dst, double sigma_s, double sigma_r, bool adjust_outliers=false)(Global Namespace)']]], - ['an_20image_360',['an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'Binary descriptors for lines extracted from an image'],['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'Changing the contrast and brightness of an image!'],['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'Face landmark detection in an image']]], - ['an_20image_361',['an Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'Load and Display an Image'],['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'Load, Modify, and Save an Image']]], - ['analysis_362',['Analysis',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html',1,'Face Analysis'],['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html',1,'Motion Analysis'],['https://docs.opencv.org/4.2.0/d8/d09/tutorial_model_analysis.html',1,'Training Model Analysis'],['https://docs.opencv.org/4.2.0/d7/de9/group__video.html',1,'Video Analysis'],['https://docs.opencv.org/4.2.0/d3/db0/tutorial_py_table_of_contents_video.html',1,'Video Analysis'],['https://docs.opencv.org/4.2.0/de/db6/tutorial_js_table_of_contents_video.html',1,'Video Analysis']]], - ['analysis_20and_20object_20tracking_363',['Motion Analysis and Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'']]], - ['analysis_20and_20shape_20descriptors_364',['Structural Analysis and Shape Descriptors',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'']]], - ['analysis_20iqa_20api_365',['Image Quality Analysis (IQA) API',['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'']]], - ['analysis_20pca_366',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], - ['analysis_20video_20module_367',['Video analysis (video module)',['https://docs.opencv.org/4.2.0/da/dd0/tutorial_table_of_content_video.html',1,'']]], - ['analytics_20pipeline_20with_20g_20api_368',['Face analytics pipeline with G-API',['https://docs.opencv.org/4.2.0/d8/d24/tutorial_gapi_interactive_face_detection.html',1,'']]], - ['analyze_369',['Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], - ['analyzepattern_370',['analyzePattern',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a5ac967e9f4ccfc43ca9e610b89232c24',1,'Eigen::CholmodBase::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a5ac967e9f4ccfc43ca9e610b89232c24',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a5ac967e9f4ccfc43ca9e610b89232c24',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a5ac967e9f4ccfc43ca9e610b89232c24',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a5ac967e9f4ccfc43ca9e610b89232c24',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a702560ecdddef77dc51d20ab22bd974e',1,'Eigen::IncompleteCholesky::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a3f684fb41019ca04d97ddc08a0d8be2e',1,'Eigen::IterativeSolverBase::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLDLT.html#aab040289e7ba703326c03b11fb084341',1,'Eigen::PastixLDLT::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLLT.html#a00f7fb339fe7a89af66c8307b7078804',1,'Eigen::PastixLLT::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLU.html#a4fc46a120032a448fca3b0be1c4ae5c0',1,'Eigen::PastixLU::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholesky.html#abd631e700699e3abca942ae4a40b1e88',1,'Eigen::SimplicialCholesky::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a6becf242cd792d5c8cb095184e31d699',1,'Eigen::SimplicialLDLT::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a0356f4b58924502dd71ce234ec358567',1,'Eigen::SimplicialLLT::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a9cb0e2b4ad31ec465884b2b2462db6ab',1,'Eigen::SparseLU::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#aa4f0d64bb0ee07ad15ee77c535efb8c4',1,'Eigen::SparseQR::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperILU.html#a52aa43effc247084c91a5e73720a50f6',1,'Eigen::SuperILU::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLU.html#a493cdfada27415a6037b004ff974eace',1,'Eigen::SuperLU::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a2d3f48425328d9b3cbdca369889007f3',1,'Eigen::SuperLUBase::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a2d3f48425328d9b3cbdca369889007f3',1,'SuperLUBase< _MatrixType, SuperILU< _MatrixType > >::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a2d3f48425328d9b3cbdca369889007f3',1,'SuperLUBase< _MatrixType, SuperLU< _MatrixType > >::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UmfPackLU.html#ac7ea28b2017d6b26b7b08497f294e5e6',1,'Eigen::UmfPackLU::analyzePattern()']]], - ['and_203d_20reconstruction_371',['and 3D Reconstruction',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html',1,'Camera Calibration and 3D Reconstruction'],['https://docs.opencv.org/4.2.0/d9/db7/tutorial_py_table_of_contents_calib3d.html',1,'Camera Calibration and 3D Reconstruction']]], - ['and_203d_20reconstruction_20calib3d_20module_372',['Camera calibration and 3D reconstruction (calib3d module)',['https://docs.opencv.org/4.2.0/d6/d55/tutorial_table_of_content_calib3d.html',1,'']]], - ['and_20algorithms_373',['STL iterators and algorithms',['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'']]], - ['and_20aliasing_374',['Lazy Evaluation and Aliasing',['https://eigen.tuxfamily.org/dox/TopicLazyEvaluation.html',1,'']]], - ['and_20array_20manipulation_375',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], - ['and_20brightness_20of_20an_20image_376',['Changing the contrast and brightness of an image!',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'']]], - ['and_20broadcasting_377',['Reductions, visitors and broadcasting',['https://eigen.tuxfamily.org/dox/group__TutorialReductionsVisitorsBroadcasting.html',1,'']]], - ['and_20camshift_378',['and Camshift',['https://docs.opencv.org/4.2.0/d7/d00/tutorial_meanshift.html',1,'Meanshift and Camshift'],['https://docs.opencv.org/4.2.0/db/df8/tutorial_py_meanshift.html',1,'Meanshift and Camshift'],['https://docs.opencv.org/4.2.0/df/def/tutorial_js_meanshift.html',1,'Meanshift and Camshift']]], - ['and_20channel_20composition_20functions_379',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], - ['and_20charuco_380',['Calibration with ArUco and ChArUco',['https://docs.opencv.org/4.2.0/da/d13/tutorial_aruco_calibration.html',1,'']]], - ['and_20circles_20for_20contours_381',['Creating Bounding boxes and circles for contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'']]], - ['and_20cmake_382',['Using OpenCV with gcc and CMake',['https://docs.opencv.org/4.2.0/db/df5/tutorial_linux_gcc_cmake.html',1,'']]], - ['and_20cmake_20version_203_209_201_383',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], - ['and_20coefficient_20wise_20operations_384',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], - ['and_20composition_20functionality_385',['G-API Drawing and composition functionality',['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'']]], - ['and_20decompositions_386',['and decompositions',['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'Dense linear problems and decompositions'],['https://eigen.tuxfamily.org/dox/group__TutorialLinearAlgebra.html',1,'Linear algebra and decompositions']]], - ['and_20derivated_20tools_387',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], - ['and_20description_388',['and Description',['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/db/d27/tutorial_py_table_of_contents_feature2d.html',1,'Feature Detection and Description']]], - ['and_20dilating_389',['Eroding and Dilating',['https://docs.opencv.org/4.2.0/db/df6/tutorial_erosion_dilatation.html',1,'']]], - ['and_20display_20an_20image_390',['Load and Display an Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'']]], - ['and_20ellipses_20for_20contours_391',['Creating Bounding rotated boxes and ellipses for contours',['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'']]], - ['and_20functions_392',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], - ['and_20images_20matching_393',['Features Finding and Images Matching',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'']]], - ['and_20implementation_20classes_394',['and Implementation Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01501.html',1,'Base and Implementation Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01497.html',1,'Base and Implementation Classes']]], - ['and_20improvement_20techniques_395',['Performance Measurement and Improvement Techniques',['https://docs.opencv.org/4.2.0/dc/d71/tutorial_py_optimization.html',1,'']]], - ['and_20indexing_396',['Slicing and Indexing',['https://eigen.tuxfamily.org/dox/group__TutorialSlicingIndexing.html',1,'']]], - ['and_20information_397',['Initialization and Information',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html',1,'']]], - ['and_20its_20use_20for_20image_20processing_398',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], - ['and_20matches_399',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], - ['and_20matching_400',['Shape Distance and Matching',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html',1,'']]], - ['and_20media_20highgui_20module_401',['High Level GUI and Media (highgui module)',['https://docs.opencv.org/4.2.0/d0/de2/tutorial_table_of_content_highgui.html',1,'']]], - ['and_20multi_20threading_402',['Eigen and multi-threading',['https://eigen.tuxfamily.org/dox/TopicMultiThreading.html',1,'']]], - ['and_20object_20tracking_403',['Motion Analysis and Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'']]], - ['and_20operations_404',['C structures and operations',['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'']]], - ['and_20orb_20planar_20tracking_405',['AKAZE and ORB planar tracking',['https://docs.opencv.org/4.2.0/dc/d16/tutorial_akaze_tracking.html',1,'']]], - ['and_20other_20classes_406',['Extending MatrixBase (and other classes)',['https://eigen.tuxfamily.org/dox/TopicCustomizing_Plugins.html',1,'']]], - ['and_20other_20intel_20perceptual_20computing_20sdk_20compatible_20depth_20sensors_407',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], - ['and_20other_20openni_20compatible_20depth_20sensors_408',['Using Kinect and other OpenNI compatible depth sensors',['https://docs.opencv.org/4.2.0/d7/d6f/tutorial_kinect_openni.html',1,'']]], - ['and_20output_20imgcodecs_20module_409',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], - ['and_20output_20using_20xml_20and_20yaml_20files_410',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], - ['and_20output_20videoio_20module_411',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], - ['and_20policy_20classes_412',['and Policy Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01531.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01535.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01529.html',1,'Base and Policy Classes']]], - ['and_20pose_20estimation_413',['CNN for 3D Object Classification and Pose Estimation',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'']]], - ['and_20pose_20estimation_20api_414',['3D object recognition and pose estimation API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'']]], - ['and_20reading_20datasets_415',['Creating, Writing and Reading Datasets',['https://docs.opencv.org/4.2.0/d4/d93/tutorial_hdf_create_read_write_datasets.html',1,'']]], - ['and_20real_20world_20vision_416',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], - ['and_20recognition_417',['Scene Text Detection and Recognition',['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'']]], - ['and_20rotated_20brief_418',['ORB (Oriented FAST and Rotated BRIEF)',['https://docs.opencv.org/4.2.0/d1/d89/tutorial_py_orb.html',1,'']]], - ['and_20save_20an_20image_419',['Load, Modify, and Save an Image',['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'']]], - ['and_20search_20in_20multi_20dimensional_20spaces_420',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], - ['and_20shape_20descriptors_421',['Structural Analysis and Shape Descriptors',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'']]], - ['and_20similarity_20measurement_422',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], - ['and_20ssim_20on_20the_20gpu_423',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], - ['and_20subtract_424',['Element-wise add and subtract',['https://docs.opencv.org/4.2.0/d8/d6f/group__core__hal__interface__addsub.html',1,'']]], - ['and_20system_20functions_20and_20macros_425',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], - ['and_20text_20with_20opencv_426',['Random generator and text with OpenCV',['https://docs.opencv.org/4.2.0/df/d61/tutorial_random_generator_and_text.html',1,'']]], - ['and_20time_20measurement_20with_20opencv_427',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], - ['and_20tutorials_428',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], - ['and_20typename_20keywords_20in_20c_429',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], - ['and_20vector_20arithmetic_430',['Matrix and vector arithmetic',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixArithmetic.html',1,'']]], - ['and_20vertical_20lines_20by_20using_20morphological_20operations_431',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], - ['and_20watershed_20algorithm_432',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], - ['and_20writing_433',['Image file reading and writing',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html',1,'']]], - ['and_20writing_20attributes_434',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]], - ['and8u_435',['and8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga1a479a26d137b754fbc2b1741a7ac896',1,'cv::hal::and8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga1a479a26d137b754fbc2b1741a7ac896',1,'and8u(const uchar *src1, size_t step1, const uchar *src2, size_t step2, uchar *dst, size_t step, int width, int height, void *)(Global Namespace)']]], - ['android_20camera_20preview_20based_20cv_20application_436',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], - ['android_20development_437',['Introduction into Android Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'']]], - ['android_20development_20with_20opencv_438',['Android Development with OpenCV',['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'']]], - ['android_20device_439',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], - ['android_5fdev_5fintro_2emarkdown_440',['android_dev_intro.markdown',['https://docs.opencv.org/4.2.0/d1/dc0/android__dev__intro_8markdown.html',1,'']]], - ['android_5focl_5fintro_2emarkdown_441',['android_ocl_intro.markdown',['https://docs.opencv.org/4.2.0/d1/dd0/android__ocl__intro_8markdown.html',1,'']]], - ['ang_5fth_442',['ang_th',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#a7151b3d4884a15d9a55962017dcf8b1b',1,'cv::line_descriptor::LSDParam']]], - ['angle_443',['angle',['https://docs.opencv.org/4.2.0/d9/daa/structcvhalKeyPoint.html#a1fda20d16c9d38251b1224047001782d',1,'cvhalKeyPoint::angle'],['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a041a6bbf2fc22e3ab9f5a80ef5a5b922',1,'cv::line_descriptor::KeyLine::angle'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#a4484e94502486930e94e7391adf9d215',1,'cv::KeyPoint::angle'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a40a8833052852341dffc442d7001421b',1,'cv::ppf_match_3d::Pose3D::angle'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a6bd95a46f9ab83a4f384a4d4845e6332',1,'cv::RotatedRect::angle'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a5bcd8f21aa18b629e2b5c64d03caeb96',1,'Eigen::AngleAxis::angle()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a5c9671c47a3b26c2b585042f42426d7e',1,'Eigen::AngleAxis::angle() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ab3cde04b655d42682d1f79952f8ef2f8',1,'Eigen::Rotation2D::angle()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ab1296dc7fcb23fdcd2c8e648e87d5d6a',1,'Eigen::Rotation2D::angle() const']]], - ['angle_5frow_444',['ANGLE_ROW',['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#a601e66398b65495a3712b7486c23eb43',1,'cv::cuda::ORB::ANGLE_ROW'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a3b5156553e52661b04bf02fa9628f746ab6931becd145cd66fbd03c80896cb3de',1,'cv::cuda::SURF_CUDA::ANGLE_ROW']]], - ['angle_5fstep_445',['angle_step',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#af9e47c5d420dfe5f53eb6a615222d9ca',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['angle_5fstep_5fradians_446',['angle_step_radians',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#aac17f71a9392d3152a57b5c59ec29b2c',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['angle_5fstep_5frelative_447',['angle_step_relative',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#ad5329f040b31639cb47c32fd7bdd5cb7',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['angleaxis_448',['AngleAxis',['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html',1,'Eigen::AngleAxis< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a08752eea5e7762f2585fbd8136dc7b4b',1,'Eigen::AngleAxis::AngleAxis()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a7c6bdf26fc162c6423d7cff097a9a00e',1,'Eigen::AngleAxis::AngleAxis(const AngleAxis< OtherScalarType > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a2e6eee34f611e4c762fdd4e4bc5935e6',1,'Eigen::AngleAxis::AngleAxis(const MatrixBase< Derived > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#af3476809863b6a0dfe17f49a3dcc6530',1,'Eigen::AngleAxis::AngleAxis(const QuaternionBase< QuatDerived > &q)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#ab58bae23f0af86d66d8aa1dc5c1dbe39',1,'Eigen::AngleAxis::AngleAxis(const Scalar &angle, const MatrixBase< Derived > &axis)']]], - ['angleaxisd_449',['AngleAxisd',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaed936d6e9192d97f00a9608081fa9b64',1,'Eigen::AngleAxisd'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaed936d6e9192d97f00a9608081fa9b64',1,'AngleAxisd(Global Namespace)']]], - ['angleaxisf_450',['AngleAxisf',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gad823b9c674644b14d950fbfe165dfdbf',1,'Eigen::AngleAxisf'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gad823b9c674644b14d950fbfe165dfdbf',1,'AngleAxisf(Global Namespace)']]], - ['angleaxistype_451',['AngleAxisType',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aed266c63b10a4028304901d9c8614199',1,'Eigen::QuaternionBase::AngleAxisType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aed266c63b10a4028304901d9c8614199',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::AngleAxisType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aed266c63b10a4028304901d9c8614199',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::AngleAxisType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aed266c63b10a4028304901d9c8614199',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::AngleAxisType']]], - ['anglerangeoption_452',['AngleRangeOption',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3e',1,'cv::ximgproc']]], - ['anglethreshold_453',['angleThreshold',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a1bc93cb13d3a07ec8901b070aa726f8f',1,'cv::rgbd::FastICPOdometry']]], - ['angulardistance_454',['angularDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a74f13d7c853484996494c26c633ae02a',1,'Eigen::QuaternionBase::angularDistance()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a74f13d7c853484996494c26c633ae02a',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::angularDistance()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a74f13d7c853484996494c26c633ae02a',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::angularDistance()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a74f13d7c853484996494c26c633ae02a',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::angularDistance()']]], - ['anisotropic_20image_20segmentation_20by_20a_20gradient_20structure_20tensor_455',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], - ['anisotropic_20image_20segmentation_20on_20g_20api_456',['Porting anisotropic image segmentation on G-API',['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'']]], - ['anisotropic_5fimage_5fsegmentation_2emarkdown_457',['anisotropic_image_segmentation.markdown',['https://docs.opencv.org/4.2.0/d8/d5f/anisotropic__image__segmentation_8markdown.html',1,'']]], - ['anisotropicdiffusion_458',['anisotropicDiffusion',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#gaffedd976e0a8efb5938107acab185ec2',1,'cv::ximgproc::anisotropicDiffusion()'],['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#gaffedd976e0a8efb5938107acab185ec2',1,'anisotropicDiffusion()(Global Namespace)']]], - ['ann_5fmlp_459',['ANN_MLP',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html',1,'cv::ml']]], - ['ann_5fmlp_5fanneal_460',['ANN_MLP_ANNEAL',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ga41d135383c258bd312a54a7964a6e7c3',1,'cv::ml::ANN_MLP_ANNEAL'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ga41d135383c258bd312a54a7964a6e7c3',1,'ANN_MLP_ANNEAL(Global Namespace)']]], - ['anneal_461',['ANNEAL',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a012b34ee340b5d4d11b6844e12816181a1c1f898fdf7406d1f114ddfd8e06ae4e',1,'cv::ml::ANN_MLP']]], - ['annotate_5fbase_462',['annotate_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10679.html',1,'__gnu_cxx']]], - ['another_463',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], - ['any_464',['any',['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html',1,'cv::util::any'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html',1,'std::experimental::fundamentals_v1::any'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01007.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#ae19f50e18243258f74bb699a5bd0bf51',1,'cv::util::any::any(value_t &&arg)'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#aeba873daa7708d06ce97c8350b87a906',1,'cv::util::any::any(any const &src)'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a1b5428abca0acb621ef6f3efc28d0ed1',1,'cv::util::any::any(any &src)'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a4e6dcc8c6ab0241a5e38161d0b84910a',1,'cv::util::any::any()=default'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a2ed210725661401aa53c0bf76f91a263',1,'cv::util::any::any(any &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac04f8abc0698b5d65081d1253d68aca9',1,'std::bitset::any()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a6ba2922445d4e290bfc4e2437c61417b',1,'std::experimental::fundamentals_v1::any::any() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a17c5dbe5004a59d142907072bffe439c',1,'std::experimental::fundamentals_v1::any::any(const any &__other)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a347ce9a01a1c622c06338b2725dcba31',1,'std::experimental::fundamentals_v1::any::any(any &&__other) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#acd927b924b7895c43b139485ad2b2e31',1,'std::experimental::fundamentals_v1::any::any(_ValueType &&__value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#acd927b924b7895c43b139485ad2b2e31',1,'std::experimental::fundamentals_v1::any::any(_ValueType &&__value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ac7d91a54176095fd09f6082d2933590c',1,'std::tr2::dynamic_bitset::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#abfbf4cb72dd577e62fbe035b1c53e695',1,'Eigen::DenseBase::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#abfbf4cb72dd577e62fbe035b1c53e695',1,'DenseBase< ArrayWrapper< ExpressionType > >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#abfbf4cb72dd577e62fbe035b1c53e695',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#abfbf4cb72dd577e62fbe035b1c53e695',1,'DenseBase< Solve< Decomposition, RhsType > >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'Eigen::VectorwiseOp::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const Derived, Horizontal >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const Derived, Vertical >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::any()']]], - ['any_20type_465',['Type-safe container of any type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html',1,'']]], - ['any_2eh_466',['any.h',['https://docs.opencv.org/4.2.0/df/d8d/any_8h.html',1,'']]], - ['any_2ehpp_467',['any.hpp',['https://docs.opencv.org/4.2.0/d2/d62/any_8hpp.html',1,'']]], - ['any_5fcast_468',['any_cast',['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#ae7ef1dbc0cdc39ec050a9c98622bd25d',1,'cv::util::any::any_cast'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a766e0179482d6c484ce23889d4bebcc9',1,'cv::util::any::any_cast'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a3241d508b69fbd3fda35e2c297329b09',1,'cv::util::any_cast(any *operand)'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#ae14333b7e35289b31d2ba7cc998df881',1,'cv::util::any_cast(const any *operand)'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#acde17b4fdf07e20074b6314b6b9704c5',1,'cv::util::any_cast(any &operand)'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a68860eb2eecf2ff73e997b4475ce3bd3',1,'cv::util::any_cast(const any &operand)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#ga3804b3e41a5ff0dae8d32c2cf453995f',1,'any_cast(const any &__any)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#ga07b480a27e1afe811ba7f9a00b872b02',1,'any_cast(any &__any)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#ga1caa36240a2b94c244dbe57273c0be2d',1,'any_cast(any &&__any)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#gad86d82adff5b2c8d613f2f248729aa02',1,'any_cast(const any *__any) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#ga30e7b55472db9e7d44060e5db2c2f255',1,'any_cast(any *__any) noexcept(Global Namespace)']]], - ['any_5fof_469',['any_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaa8fada47994395ec51bb54536d6a87f9',1,'std::any_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaa8fada47994395ec51bb54536d6a87f9',1,'any_of(_InputIterator __first, _InputIterator __last, _Predicate __pred)(Global Namespace)']]], - ['api_470',['API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'3D object recognition and pose estimation API'],['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'Adding a new algorithm to the Facemark API'],['https://docs.opencv.org/4.2.0/d0/d71/classcv_1_1detail_1_1GCompoundKernelImpl.html#a0118297d188a70c35b4071109d9921ca',1,'cv::detail::GCompoundKernelImpl::API'],['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1GCPUKernelImpl.html#aa5bdd54f0550151b76dfa896dacaf347',1,'cv::GCPUKernelImpl::API'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1GFluidKernelImpl.html#ad9654fa0fdd7323acf55e4b69c6000f4',1,'cv::GFluidKernelImpl::API'],['https://docs.opencv.org/4.2.0/dc/de8/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a8deb9cb3b86d9ff737551479d58223a1',1,'cv::GNetworkType< K, std::function< R(Args...)> >::API'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a250c7a499bcf263c64413b6a82addb00',1,'cv::GNetworkType< K, std::function< std::tuple< R... >(Args...)> >::API'],['https://docs.opencv.org/4.2.0/d0/d0d/classcv_1_1GOCLKernelImpl.html#a89c12b602953b44d6488fb60efbff2b6',1,'cv::GOCLKernelImpl::API'],['https://docs.opencv.org/4.2.0/d1/d8a/classcv_1_1GPlaidMLKernelImpl.html#a849b26d7b5f1f0c8f1e6e7d6a75c60c7',1,'cv::GPlaidMLKernelImpl::API'],['https://docs.opencv.org/4.2.0/db/d1f/classcv_1_1GTransformImpl_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a9c44d6f37621f1442c9ead63a30fb67f',1,'cv::GTransformImpl< K, std::function< R(Args...)> >::API'],['https://docs.opencv.org/4.2.0/da/d57/group__core__async.html',1,'Asynchronous API'],['https://docs.opencv.org/4.2.0/df/d4e/group__imgproc__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/da/d0a/group__imgcodecs__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d0/d28/group__highgui__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d3/d12/group__video__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d5/db8/group__calib3d__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d9/d31/group__objdetect__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d3/d40/group__photo__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d8/d24/tutorial_gapi_interactive_face_detection.html',1,'Face analytics pipeline with G-API'],['https://docs.opencv.org/4.2.0/d0/d1e/gapi.html',1,'Graph API'],['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'Image Quality Analysis (IQA) API'],['https://docs.opencv.org/4.2.0/d4/d48/tutorial_gapi_face_beautification.html',1,'Implementing a face beautification algorithm with G-API'],['https://docs.opencv.org/4.2.0/d0/d25/gapi_kernel_api.html',1,'Kernel API'],['https://docs.opencv.org/4.2.0/df/d3a/group__phase__unwrapping.html',1,'Phase Unwrapping API'],['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'Porting anisotropic image segmentation on G-API'],['https://docs.opencv.org/4.2.0/d8/d65/group__saliency.html',1,'Saliency API'],['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html',1,'Structured Light API'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html',1,'Tracking API'],['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'Tutorial on Facial Landmark Detector API'],['https://docs.opencv.org/4.2.0/d7/dec/tutorial_facemark_usage.html',1,'Using the Facemark API'],['https://docs.opencv.org/4.2.0/d6/dc9/gapi_purposes.html',1,'Why Graph API?']]], - ['api_20backends_471',['Additional flags for video I/O API backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'']]], - ['api_20backends_20registry_472',['Query I/O API backends registry',['https://docs.opencv.org/4.2.0/de/db1/group__videoio__registry.html',1,'']]], - ['api_20core_20functionality_473',['G-API Core functionality',['https://docs.opencv.org/4.2.0/df/d1f/group__gapi__core.html',1,'']]], - ['api_20data_20types_474',['G-API Data Types',['https://docs.opencv.org/4.2.0/db/df1/group__gapi__data__objects.html',1,'']]], - ['api_20drawing_20and_20composition_20functionality_475',['G-API Drawing and composition functionality',['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'']]], - ['api_20for_20external_20libraries_20plugins_476',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], - ['api_20for_20video_20i_20o_477',['C API for video I/O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__c.html',1,'']]], - ['api_20framework_478',['G-API framework',['https://docs.opencv.org/4.2.0/d7/d0d/group__gapi.html',1,'']]], - ['api_20gapi_20module_479',['Graph API (gapi module)',['https://docs.opencv.org/4.2.0/df/d7e/tutorial_table_of_content_gapi.html',1,'']]], - ['api_20graph_20compilation_20arguments_480',['G-API Graph Compilation Arguments',['https://docs.opencv.org/4.2.0/d9/d29/group__gapi__compile__args.html',1,'']]], - ['api_20image_20processing_20functionality_481',['G-API Image processing functionality',['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'']]], - ['api_20main_20classes_482',['G-API Main Classes',['https://docs.opencv.org/4.2.0/d8/dd0/group__gapi__main__classes.html',1,'']]], - ['api_20metadata_20descriptors_483',['G-API Metadata Descriptors',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html',1,'']]], - ['api_20opencl_20cl_20va_20interoperability_484',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], - ['api_20overview_485',['G-API Overview',['https://docs.opencv.org/4.2.0/db/d87/md_gapi_doc_slides_README.html',1,'']]], - ['api_20standard_20backends_486',['G-API Standard Backends',['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html',1,'']]], - ['api_20stitcher_20class_487',['High level stitching API (Stitcher class)',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'']]], - ['api_3a_20converting_20image_20from_20one_20color_20space_20to_20another_488',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], - ['api_3a_20image_20and_20channel_20composition_20functions_489',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], - ['api_3a_20image_20filters_490',['Graph API: Image filters',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html',1,'']]], - ['api_3a_20math_20operations_491',['Graph API: Math operations',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html',1,'']]], - ['api_3a_20operations_20on_20matrices_492',['Graph API: Operations on matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'']]], - ['api_3a_20pixelwise_20operations_493',['Graph API: Pixelwise operations',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html',1,'']]], - ['api_5fdescription_494',['api_description',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#a126f169513031bd754899ff3f9b4a3bd',1,'OpenCV_API_Header']]], - ['api_5fversion_495',['api_version',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#a40d9cc3d5864f0d2a99e306228a37cdc',1,'OpenCV_API_Header']]], - ['apilist_496',['APIList',['https://docs.opencv.org/4.2.0/dc/de8/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a4eb2af7049d77384e99d857c7aeea95f',1,'cv::GNetworkType< K, std::function< R(Args...)> >::APIList'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a916f57342e4279138f2978779ead6497',1,'cv::GNetworkType< K, std::function< std::tuple< R... >(Args...)> >::APIList']]], - ['app_497',['app',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'basic_ios< char, _Traits >::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'basic_iostream< char >::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'basic_istream< char >::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'basic_istream< char, _Traits >::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'basic_ostream< char >::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'basic_ostream< char, _Traits >::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_fstream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_ifstream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_ios::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_iostream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_istream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_istringstream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_ofstream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_ostream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_ostringstream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_stringstream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::ios_base::app']]], - ['append_498',['APPEND',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da049591e6d1749b29bb206909c70b2470',1,'cv::FileStorage']]], - ['append_499',['append',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a951ff9afc9f61474a79b0233ff010289',1,'__gnu_cxx::__versa_string::append(const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae5b284367d022a51a33e4118e25866bb',1,'__gnu_cxx::__versa_string::append(const __versa_string &__str, size_type __pos, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aea54d824534ee9f125a58ec9033cdd48',1,'__gnu_cxx::__versa_string::append(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae6d34116930903e7bc8354fe92ef8593',1,'__gnu_cxx::__versa_string::append(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a3fb56cb34ced33afd4b5c53b30c10a46',1,'__gnu_cxx::__versa_string::append(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a4f19cd669d7f21d93f5fb36ba8384e65',1,'__gnu_cxx::__versa_string::append(std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9f84dceb2e21c9e61ca067d54c2957ad',1,'__gnu_cxx::__versa_string::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'__gnu_debug::basic_string::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'__gnu_debug::basic_string::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'__gnu_debug::basic_string::append(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< _CharT >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< _CharT >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< _CharT >::append(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< _CharT >::append(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< _CharT >::append(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< _CharT >::append(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< _CharT >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< _CharT, _Traits, _Allocator >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< _CharT, _Traits, _Allocator >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< _CharT, _Traits, _Allocator >::append(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< _CharT, _Traits, _Allocator >::append(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< _CharT, _Traits, _Allocator >::append(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< _CharT, _Traits, _Allocator >::append(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< _CharT, _Traits, _Allocator >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(const _Elem *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(size_type __n, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< char >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< char >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< char >::append(const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< char >::append(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< char >::append(size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< char >::append(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< char >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< char_type, _Traits, _Alloc >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< char_type, _Traits, _Alloc >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< char_type, _Traits, _Alloc >::append(const char_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< char_type, _Traits, _Alloc >::append(const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< char_type, _Traits, _Alloc >::append(size_type __n, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< char_type, _Traits, _Alloc >::append(initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< char_type, _Traits, _Alloc >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< value_type >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< value_type >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< value_type >::append(const value_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< value_type >::append(const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< value_type >::append(size_type __n, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< value_type >::append(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< value_type >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'std::basic_string::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'std::basic_string::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'std::basic_string::append(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'std::basic_string::append(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'std::basic_string::append(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'std::basic_string::append(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'std::basic_string::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a15d3fb346ccfcba83148dcc3dbcfe41f',1,'std::tr2::dynamic_bitset::append(block_type __block)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab096eed28395ba93a82038788496953e',1,'std::tr2::dynamic_bitset::append(_BlockInputIterator __first, _BlockInputIterator __last)']]], - ['appendpose_500',['appendPose',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a4aaae88410db92cad52250668e24b5c6',1,'cv::ppf_match_3d::Pose3D']]], - ['application_501',['Add a Trackbar to Your Application',['https://docs.opencv.org/4.2.0/d5/df3/tutorial_js_trackbar.html',1,'']]], - ['application_502',['application',['https://docs.opencv.org/4.2.0/d7/d21/tutorial_interactive_calibration.html',1,'Interactive camera calibration application'],['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'Use OpenCL in Android camera preview based CV application']]], - ['applications_503',['applications',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'Adding a Trackbar to our applications!'],['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'Interactive Visual Debugging of Computer Vision applications']]], - ['applications_20with_20opencv_20inside_20the_20microsoft_20visual_20studio_504',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['apply_505',['apply',['https://docs.opencv.org/4.2.0/d7/df6/classcv_1_1BackgroundSubtractor.html#aa735e76f7069b3fa9c3f32395f9ccd21',1,'cv::BackgroundSubtractor::apply()'],['https://docs.opencv.org/4.2.0/de/dca/classcv_1_1bgsegm_1_1BackgroundSubtractorCNT.html#a2b5caeaf02d92a97395d68df0c93b4a8',1,'cv::bgsegm::BackgroundSubtractorCNT::apply()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a9bfd022be3fb7696e7a16ba2a49d201f',1,'cv::cuda::BackgroundSubtractorGMG::apply()'],['https://docs.opencv.org/4.2.0/d4/dd5/classcv_1_1bgsegm_1_1BackgroundSubtractorGSOC.html#ae175a4304d2d0f025398858592e8d73b',1,'cv::bgsegm::BackgroundSubtractorGSOC::apply()'],['https://docs.opencv.org/4.2.0/de/d4c/classcv_1_1bgsegm_1_1BackgroundSubtractorLSBP.html#a9cc2c37d5d5ebe7e5ff0709d5adc1269',1,'cv::bgsegm::BackgroundSubtractorLSBP::apply()'],['https://docs.opencv.org/4.2.0/d1/dfe/classcv_1_1cuda_1_1BackgroundSubtractorMOG.html#a8f52d2f7abd1c77c84243efc53972cbf',1,'cv::cuda::BackgroundSubtractorMOG::apply()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a682adde901148d85450435e6cc0de4a1',1,'cv::BackgroundSubtractorMOG2::apply()'],['https://docs.opencv.org/4.2.0/df/d23/classcv_1_1cuda_1_1BackgroundSubtractorMOG2.html#a92408f07bf1268c1b778cb186b3113b0',1,'cv::cuda::BackgroundSubtractorMOG2::apply()'],['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a7d9f7cc4906521e2e94477472b96a8d6',1,'cv::detail::BlocksCompensator::apply()'],['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html#acae1be1bd0051e970ec02764a522e325',1,'cv::detail::BlocksGainCompensator::apply()'],['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html#ab45c3aa811a6d380cc77a86dbb87520a',1,'cv::detail::ChannelsCompensator::apply()'],['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1CLAHE.html#a4e92e0e427de21be8d1fae8dcd862c5e',1,'cv::CLAHE::apply()'],['https://docs.opencv.org/4.2.0/db/d79/classcv_1_1cuda_1_1CLAHE.html#a60d2b58f7cb010aab249feee3305d106',1,'cv::cuda::CLAHE::apply()'],['https://docs.opencv.org/4.2.0/d5/d57/structcv_1_1hal_1_1DCT2D.html#a65e394512aa7960c2a417664bc9eb88a',1,'cv::hal::DCT2D::apply()'],['https://docs.opencv.org/4.2.0/d8/d03/structcv_1_1hal_1_1DFT1D.html#a0417fccdd79e564bf77dee93fcbb2bba',1,'cv::hal::DFT1D::apply()'],['https://docs.opencv.org/4.2.0/d6/d77/structcv_1_1hal_1_1DFT2D.html#a63f9dcbe4f9a89185087b399270de94b',1,'cv::hal::DFT2D::apply()'],['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#a2e2d2eb668d213a402c68044ac2b0aba',1,'cv::cuda::DisparityBilateralFilter::apply()'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#a473eaf1e585804c08d77c91e004f93aa',1,'cv::detail::ExposureCompensator::apply()'],['https://docs.opencv.org/4.2.0/dc/d2b/classcv_1_1cuda_1_1Filter.html#a20b58d13871027473b4c39cc698cf80f',1,'cv::cuda::Filter::apply()'],['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#a46c3121e915fd439f88bbbe3a54b18ef',1,'cv::detail::GainCompensator::apply()'],['https://docs.opencv.org/4.2.0/df/d95/classcv_1_1detail_1_1GCompoundKernel.html#aed2335850dcab6603305c09ba05f79e2',1,'cv::detail::GCompoundKernel::apply()'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#aa25bc73f7cba9bb2f9992edaa248f868',1,'cv::GComputation::apply(GRunArgs &&ins, GRunArgsP &&outs, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#aafd7a4d5103eafc398ebd15564ee059e',1,'cv::GComputation::apply(cv::Mat in, cv::Mat &out, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a12fd86d3cc5140df37d6a8aa0a0f7230',1,'cv::GComputation::apply(cv::Mat in, cv::Scalar &out, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#ad35660e432c5ec676fe2830eb8a9651b',1,'cv::GComputation::apply(cv::Mat in1, cv::Mat in2, cv::Mat &out, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a4eb4b830d5cdf6891470a3b111b0e619',1,'cv::GComputation::apply(cv::Mat in1, cv::Mat in2, cv::Scalar &out, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#acacdf438026f43ec0db3d84e5b02d340',1,'cv::GComputation::apply(const std::vector< cv::Mat > &ins, std::vector< cv::Mat > &outs, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/dd/d0d/classcv_1_1GComputationT_3_01R_07Args_8_8_8_08_4.html#a0065e2b7c54a83b55c8d55607441ee5d',1,'cv::GComputationT< R(Args...)>::apply()'],['https://docs.opencv.org/4.2.0/dd/d97/classcv_1_1GComputationT_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4.html#a2de3a070b1580db7f82df16ddab63b2c',1,'cv::GComputationT< std::tuple< R... >(Args...)>::apply()'],['https://docs.opencv.org/4.2.0/df/d27/classcv_1_1GCPUKernel.html#a50f75ca947cfbe574a41e61d1a6ce5f3',1,'cv::GCPUKernel::apply()'],['https://docs.opencv.org/4.2.0/d5/d65/classcv_1_1GOCLKernel.html#a4c2736a75bb29feb1ddd387947135393',1,'cv::GOCLKernel::apply()'],['https://docs.opencv.org/4.2.0/df/db7/classcv_1_1GPlaidMLKernel.html#aa6ad01b741587b0e02668dfb4bca8c59',1,'cv::GPlaidMLKernel::apply()'],['https://docs.opencv.org/4.2.0/d2/dc1/classcv_1_1detail_1_1NoExposureCompensator.html#a85ba499493a5793474d2801e8c249c06',1,'cv::detail::NoExposureCompensator::apply()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6187e472096936d517db9cd9851fc107',1,'std::valarray::apply(_Tp func(_Tp)) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4fc494f4aee2efb200793044d68658c5',1,'std::valarray::apply(_Tp func(const _Tp &)) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6187e472096936d517db9cd9851fc107',1,'valarray< size_t >::apply(size_t func(size_t)) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4fc494f4aee2efb200793044d68658c5',1,'valarray< size_t >::apply(size_t func(const size_t &)) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6187e472096936d517db9cd9851fc107',1,'apply(_Tp func(_Tp)) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4fc494f4aee2efb200793044d68658c5',1,'apply(_Tp func(const _Tp &)) const(Global Namespace)']]], - ['apply_5fgenerator_506',['apply_generator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01599.html#a901aed464640d1d4b48ea99ef8456964',1,'__gnu_cxx::typelist']]], - ['applychannelgains_507',['applyChannelGains',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga95fba1ce3eb262ed1b5dbb4385f8b590',1,'cv::xphoto::applyChannelGains()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga95fba1ce3eb262ed1b5dbb4385f8b590',1,'applyChannelGains()(Global Namespace)']]], - ['applycolormap_508',['applyColorMap',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gadf478a5e5ff49d8aa24e726ea6f65d15',1,'cv::applyColorMap(InputArray src, OutputArray dst, int colormap)'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gacb22288ddccc55f9bd9e6d492b409cae',1,'cv::applyColorMap(InputArray src, OutputArray dst, InputArray userColor)'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gadf478a5e5ff49d8aa24e726ea6f65d15',1,'applyColorMap(InputArray src, OutputArray dst, int colormap)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gacb22288ddccc55f9bd9e6d492b409cae',1,'applyColorMap(InputArray src, OutputArray dst, InputArray userColor)(Global Namespace)']]], - ['applyfasttonemapping_509',['applyFastToneMapping',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a1bb2ed3bee0ced414ed0533fba641dec',1,'cv::bioinspired::Retina::applyFastToneMapping()'],['https://docs.opencv.org/4.2.0/dd/d73/classcv_1_1bioinspired_1_1RetinaFastToneMapping.html#ad84c0513227ddaa3fb0c23cc37cc4f3a',1,'cv::bioinspired::RetinaFastToneMapping::applyFastToneMapping()']]], - ['applyhalidescheduler_510',['applyHalideScheduler',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a8af8ddbbb682edf69f1abd78ea25c79b',1,'cv::dnn::Layer']]], - ['applyhouseholderontheleft_511',['applyHouseholderOnTheLeft',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8f2c8059ef3f04cfa0c73b4c012db855',1,'Eigen::MatrixBase::applyHouseholderOnTheLeft()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8f2c8059ef3f04cfa0c73b4c012db855',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::applyHouseholderOnTheLeft()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8f2c8059ef3f04cfa0c73b4c012db855',1,'MatrixBase< Solve< Decomposition, RhsType > >::applyHouseholderOnTheLeft()']]], - ['applyhouseholderontheright_512',['applyHouseholderOnTheRight',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab3e52262b41fa40e194dda245e0f9675',1,'Eigen::MatrixBase::applyHouseholderOnTheRight()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab3e52262b41fa40e194dda245e0f9675',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::applyHouseholderOnTheRight()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab3e52262b41fa40e194dda245e0f9675',1,'MatrixBase< Solve< Decomposition, RhsType > >::applyHouseholderOnTheRight()']]], - ['applyontheleft_513',['applyOnTheLeft',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3a08ad41e81d8ad4a37b5d5c7490e765',1,'Eigen::MatrixBase::applyOnTheLeft(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae669131f6e18f7e8f06fae271754f435',1,'Eigen::MatrixBase::applyOnTheLeft(Index p, Index q, const JacobiRotation< OtherScalar > &j)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3a08ad41e81d8ad4a37b5d5c7490e765',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::applyOnTheLeft(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae669131f6e18f7e8f06fae271754f435',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::applyOnTheLeft(Index p, Index q, const JacobiRotation< OtherScalar > &j)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3a08ad41e81d8ad4a37b5d5c7490e765',1,'MatrixBase< Solve< Decomposition, RhsType > >::applyOnTheLeft(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae669131f6e18f7e8f06fae271754f435',1,'MatrixBase< Solve< Decomposition, RhsType > >::applyOnTheLeft(Index p, Index q, const JacobiRotation< OtherScalar > &j)']]], - ['applyontheright_514',['applyOnTheRight',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a45d91752925d2757fc8058a293b15462',1,'Eigen::MatrixBase::applyOnTheRight(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/group__Jacobi__Module.html#gaa07f741c86219601664433777827bf1c',1,'Eigen::MatrixBase::applyOnTheRight(Index p, Index q, const JacobiRotation< OtherScalar > &j)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a45d91752925d2757fc8058a293b15462',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::applyOnTheRight(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/group__Jacobi__Module.html#gaa07f741c86219601664433777827bf1c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::applyOnTheRight(Index p, Index q, const JacobiRotation< OtherScalar > &j)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a45d91752925d2757fc8058a293b15462',1,'MatrixBase< Solve< Decomposition, RhsType > >::applyOnTheRight(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/group__Jacobi__Module.html#gaa07f741c86219601664433777827bf1c',1,'MatrixBase< Solve< Decomposition, RhsType > >::applyOnTheRight(Index p, Index q, const JacobiRotation< OtherScalar > &j)'],['https://eigen.tuxfamily.org/dox/group__Jacobi__Module.html#gaa07f741c86219601664433777827bf1c',1,'applyOnTheRight()(Global Namespace)']]], - ['applytransform_515',['applyTransform',['https://docs.opencv.org/4.2.0/d9/d26/classcv_1_1viz_1_1Widget3D.html#a45a01c3f9e91367c7de5832bc8e60d0d',1,'cv::viz::Widget3D']]], - ['applytransformation_516',['applyTransformation',['https://docs.opencv.org/4.2.0/df/dfe/classcv_1_1ShapeTransformer.html#a30227d0a64fb1747a90ed7efa1519cef',1,'cv::ShapeTransformer']]], - ['applytransformationtopoints_517',['applyTransformationToPoints',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga7b77333794ddab27da390b19baa033b2',1,'cv::sfm::applyTransformationToPoints()'],['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga7b77333794ddab27da390b19baa033b2',1,'applyTransformationToPoints()(Global Namespace)']]], - ['applytranspositionontheleft_518',['applyTranspositionOnTheLeft',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a4e3455bf12b56123e38a8220c6b508dc',1,'Eigen::PermutationBase::applyTranspositionOnTheLeft()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a4e3455bf12b56123e38a8220c6b508dc',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::applyTranspositionOnTheLeft()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a4e3455bf12b56123e38a8220c6b508dc',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::applyTranspositionOnTheLeft()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a4e3455bf12b56123e38a8220c6b508dc',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::applyTranspositionOnTheLeft()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a4e3455bf12b56123e38a8220c6b508dc',1,'PermutationBase< PermutationWrapper< _IndicesType > >::applyTranspositionOnTheLeft()']]], - ['applytranspositionontheright_519',['applyTranspositionOnTheRight',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a5f98da0712570d0c4b12f61839ae4193',1,'Eigen::PermutationBase::applyTranspositionOnTheRight()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a5f98da0712570d0c4b12f61839ae4193',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::applyTranspositionOnTheRight()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a5f98da0712570d0c4b12f61839ae4193',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::applyTranspositionOnTheRight()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a5f98da0712570d0c4b12f61839ae4193',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::applyTranspositionOnTheRight()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a5f98da0712570d0c4b12f61839ae4193',1,'PermutationBase< PermutationWrapper< _IndicesType > >::applyTranspositionOnTheRight()']]], - ['applyzadjointontheleftinplace_520',['applyZAdjointOnTheLeftInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a0a89641e0b4ea92c515405f2a31e6abe',1,'Eigen::CompleteOrthogonalDecomposition']]], - ['applyzontheleftinplace_521',['applyZOnTheLeftInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#afedd1ee41b8490b70fd1fefdd21f8c80',1,'Eigen::CompleteOrthogonalDecomposition']]], - ['approxpolydp_522',['approxPolyDP',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga0012a5fdaea70b8a9970165d98722b4c',1,'cv::approxPolyDP()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga0012a5fdaea70b8a9970165d98722b4c',1,'approxPolyDP()(Global Namespace)']]], - ['apricot_523',['apricot',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#acccf8b8c34021cbba55353ac4af4bfb5',1,'cv::viz::Color']]], - ['apriltagcriticalrad_524',['aprilTagCriticalRad',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a99fc2fa5a18922e2e23865a118d0ea9a',1,'cv::aruco::DetectorParameters']]], - ['apriltagdeglitch_525',['aprilTagDeglitch',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#ab7ffda0665ca2ba83822b768f00ed946',1,'cv::aruco::DetectorParameters']]], - ['apriltagmaxlinefitmse_526',['aprilTagMaxLineFitMse',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a750257a7d94461485c9a181e24407250',1,'cv::aruco::DetectorParameters']]], - ['apriltagmaxnmaxima_527',['aprilTagMaxNmaxima',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#acf6a0da0ae6bcd582c51ae14263df87a',1,'cv::aruco::DetectorParameters']]], - ['apriltagminclusterpixels_528',['aprilTagMinClusterPixels',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#aa5be4f1c6ac11cc6209136c7ce226112',1,'cv::aruco::DetectorParameters']]], - ['apriltagminwhiteblackdiff_529',['aprilTagMinWhiteBlackDiff',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#ae0d308524dc4ea53d0257799254f18c2',1,'cv::aruco::DetectorParameters']]], - ['apriltagquaddecimate_530',['aprilTagQuadDecimate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#ac15a220f3f842e1b5c53d5f179a35ed9',1,'cv::aruco::DetectorParameters']]], - ['apriltagquadsigma_531',['aprilTagQuadSigma',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a9b3abaa8c7c29c6a5deb4e071b3acf76',1,'cv::aruco::DetectorParameters']]], - ['ar_532',['Ar',['../group__ar.html',1,'']]], - ['ar_5fhmdb_533',['AR_hmdb',['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1datasets_1_1AR__hmdb.html',1,'cv::datasets']]], - ['ar_5fhmdb_2ehpp_534',['ar_hmdb.hpp',['https://docs.opencv.org/4.2.0/d1/d98/ar__hmdb_8hpp.html',1,'']]], - ['ar_5fhmdbobj_535',['AR_hmdbObj',['https://docs.opencv.org/4.2.0/d1/da9/structcv_1_1datasets_1_1AR__hmdbObj.html',1,'cv::datasets']]], - ['ar_5fsports_536',['AR_sports',['https://docs.opencv.org/4.2.0/d5/d36/classcv_1_1datasets_1_1AR__sports.html',1,'cv::datasets']]], - ['ar_5fsports_2ehpp_537',['ar_sports.hpp',['https://docs.opencv.org/4.2.0/d7/d90/ar__sports_8hpp.html',1,'']]], - ['ar_5fsportsobj_538',['AR_sportsObj',['https://docs.opencv.org/4.2.0/d0/dec/structcv_1_1datasets_1_1AR__sportsObj.html',1,'cv::datasets']]], - ['arclength_539',['arcLength',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8d26483c636be6b35c3ec6335798a47c',1,'cv::arcLength()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8d26483c636be6b35c3ec6335798a47c',1,'arcLength()(Global Namespace)']]], - ['ardupilotprotocol_540',['ArduPilotProtocol',['../classnet_1_1ardupilot_1_1ArduPilotProtocol.html',1,'net::ardupilot']]], - ['are_5fdifferent_541',['are_different',['https://docs.opencv.org/4.2.0/d9/dab/namespacecv_1_1util_1_1detail.html#a8a9ff8065956085e2d25c1f146df6d27',1,'cv::util::detail']]], - ['are_5fmeta_5fdescrs_542',['are_meta_descrs',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#aa9a2d974aa7c71968bfd9649ee903a36',1,'cv::detail']]], - ['are_5fmeta_5fdescrs_5fbut_5flast_543',['are_meta_descrs_but_last',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a573723d31cccc765fe39151fe46a3649',1,'cv::detail']]], - ['area_544',['area',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a088c399363a9a5fb049a8d332ce4483e',1,'cv::text::ERStat::area'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a0dba3ba97160894da4b8c8b4d8712c8e',1,'cv::Rect_::area()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a8cc3d32e40c9b5324d316c35c4773dff',1,'cv::Size_::area()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a8cc3d32e40c9b5324d316c35c4773dff',1,'Size_< float >::area()']]], - ['area_5fheight_545',['area_height',['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#a9d3ab2324aeebf48861c1b8be475f71b',1,'cv::cudev::CommonAreaInterPtr::area_height'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#ad9d0d873010be71658a02874a3542605',1,'cv::cudev::IntegerAreaInterPtr::area_height']]], - ['area_5fwidth_546',['area_width',['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#a1e1cea958df9ae5cb84607588f7eb0b7',1,'cv::cudev::CommonAreaInterPtr::area_width'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#af6be746d742b89b83e88863b4ae3e040',1,'cv::cudev::IntegerAreaInterPtr::area_width']]], - ['arg_547',['arg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga943544cb1017a51d7cafc7b4d3cd022f',1,'std::arg(const complex< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac30364b7cb8121e0f4c42b2135ef8aa5',1,'std::arg(_Tp __x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga943544cb1017a51d7cafc7b4d3cd022f',1,'arg()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#aa539408a09481d35961e11ee78793db1',1,'Eigen::arg()']]], - ['arg1_548',['arg1',['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1Binder1st.html#af20116f988cdc40eb38d7f73d05dfd91',1,'cv::cudev::Binder1st::arg1'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseTernaryOp.html#a776de41baf8921bcdba24ec2166f0a3e',1,'Eigen::CwiseTernaryOp::arg1()']]], - ['arg2_549',['arg2',['https://docs.opencv.org/4.2.0/d6/db4/structcv_1_1cudev_1_1Binder2nd.html#acdc9f0eae0dad0515fdd90d14c482774',1,'cv::cudev::Binder2nd::arg2'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseTernaryOp.html#afebd6d4ed4101bcbb34c36f99ff27fda',1,'Eigen::CwiseTernaryOp::arg2() const']]], - ['arg3_550',['arg3',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseTernaryOp.html#a07e6cc21d253ae0bd68913fb65aa8151',1,'Eigen::CwiseTernaryOp']]], - ['argkind_551',['ArgKind',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a97a661738725552712698d4c48b5d131',1,'cv::detail']]], - ['args_552',['args',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a291d5813cca476464022b0f009522741',1,'cv::ocl::Kernel']]], - ['argument_5ftype_553',['argument_type',['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'cv::cudev::unary_function::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< double, double >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< float, float >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< float, short >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< Op::first_argument_type, Op::result_type >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< Op::second_argument_type, Op::result_type >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< Predicate::argument_type, Predicate::result_type >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< schar, float >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< schar, schar >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< short, float >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< short, short >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< uchar, float >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< uchar, uchar >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< uint, float >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< uint, uint >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< ushort, float >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< ushort, ushort >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_cxx::__detail::_Ffit_finder::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_cxx::binary_compose::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_cxx::select1st::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_cxx::select2nd::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_cxx::subtractive_rng::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_cxx::unary_compose::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_parallel::__binder1st::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_parallel::__binder2nd::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_parallel::__unary_negate::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::_Maybe_unary_or_binary_function< _Res, _T1 >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::binder1st::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::binder2nd::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::const_mem_fun_ref_t::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::const_mem_fun_t::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::hash< __gnu_cxx::throw_value_limit >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::hash< __gnu_cxx::throw_value_random >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::logical_not::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::mem_fun_ref_t::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::mem_fun_t::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::negate::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::pointer_to_unary_function::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::unary_function::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::unary_negate::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< __gnu_cxx::throw_value_limit, size_t >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< __gnu_cxx::throw_value_random, size_t >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _FirstArgumentType, _ResultType >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Functor::argument_type, _Functor::result_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Operation2::argument_type, _Operation1::result_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Operation::first_argument_type, _Operation::result_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Operation::second_argument_type, _Operation::result_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Pair, _Pair::first_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Pair, _Pair::second_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Predicate::argument_type, bool >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _SecondArgumentType, _ResultType >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _T1, _Res >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Tp *, _Ret >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Tp, _Ret >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Tp, _Tp >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Tp, bool >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Value, _Value >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< argument_type, bool >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< const _Tp *, _Ret >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< pair< const _Key, _Tp >, pair< const _Key, _Tp > ::first_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< std::pair< _Tp, _Tp >, bool >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< unsigned int, unsigned int >::argument_type']]], - ['arguments_554',['G-API Graph Compilation Arguments',['https://docs.opencv.org/4.2.0/d9/d29/group__gapi__compile__args.html',1,'']]], - ['arithm_20operations_20on_20matrices_555',['Arithm Operations on Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'']]], - ['arithmetic_556',['Decimal Floating-Point Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01520.html',1,'']]], - ['arithmetic_557',['Matrix and vector arithmetic',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixArithmetic.html',1,'']]], - ['arithmetic_558',['Rational Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html',1,'']]], - ['arithmetic_20classes_559',['Arithmetic Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01506.html',1,'']]], - ['arithmetic_20operations_20on_20images_560',['Arithmetic Operations on Images',['https://docs.opencv.org/4.2.0/d0/d86/tutorial_py_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_image_arithmetics.html',1,'Arithmetic Operations on Images']]], - ['arithmeticsequence_561',['ArithmeticSequence',['https://eigen.tuxfamily.org/dox/classEigen_1_1ArithmeticSequence.html',1,'Eigen']]], - ['arm_20based_20linux_20systems_562',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]], - ['arm_5fcrosscompile_5fwith_5fcmake_2emarkdown_563',['arm_crosscompile_with_cmake.markdown',['https://docs.opencv.org/4.2.0/d5/d49/arm__crosscompile__with__cmake_8markdown.html',1,'']]], - ['armiktask_564',['ArmIKTask',['../classnet_1_1mc_1_1tasks_1_1ArmIKTask.html',1,'net::mc::tasks']]], - ['armkinematics_565',['ArmKinematics',['../classkinematics_1_1ArmKinematics.html',1,'kinematics']]], - ['armkinematics_3c_202_2c_20n_20_3e_566',['ArmKinematics< 2, N >',['../classkinematics_1_1ArmKinematics.html',1,'kinematics']]], - ['aro_5f0_5f45_567',['ARO_0_45',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3ea29ee7f86306ebea2e7e489b307e27c3d',1,'cv::ximgproc']]], - ['aro_5f315_5f0_568',['ARO_315_0',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3ea7a68852e321bceeba7d63a2784400ee1',1,'cv::ximgproc']]], - ['aro_5f315_5f135_569',['ARO_315_135',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3eacf201e7104201a24452e6ade448de92f',1,'cv::ximgproc']]], - ['aro_5f315_5f45_570',['ARO_315_45',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3eadc2b721b1557d012403d37f6a30e0d3a',1,'cv::ximgproc']]], - ['aro_5f45_5f135_571',['ARO_45_135',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3ea2e520252ceea6620dda5c8b403cfac0a',1,'cv::ximgproc']]], - ['aro_5f45_5f90_572',['ARO_45_90',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3eaa8d304ccb0d916daaf7ba094f40e7273',1,'cv::ximgproc']]], - ['aro_5f90_5f135_573',['ARO_90_135',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3eab091550fe679b3fec9aff3efe7529810',1,'cv::ximgproc']]], - ['aro_5fctr_5fhor_574',['ARO_CTR_HOR',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3ea728dc85bd644c37d0b17da12800fd266',1,'cv::ximgproc']]], - ['aro_5fctr_5fver_575',['ARO_CTR_VER',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3eaca048d27204d9cd39c4af66d86295d2f',1,'cv::ximgproc']]], - ['array_576',['Array',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'Eigen']]], - ['array_577',['array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01703.html',1,'std::array< _Tp, _Nm >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00041.html',1,'(Global Namespace)']]], - ['array_578',['Array',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Eigen::Array::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Eigen::Array::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Eigen::Array::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Eigen::Array::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Eigen::Array::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Eigen::Array::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Eigen::Array::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Eigen::Array::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Eigen::Array::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Eigen::Array::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Eigen::Array::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Eigen::Array::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< double, DPARM_SIZE, 1 >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< double, DPARM_SIZE, 1 >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< double, DPARM_SIZE, 1 >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< double, DPARM_SIZE, 1 >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< double, DPARM_SIZE, 1 >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< double, DPARM_SIZE, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< double, DPARM_SIZE, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< double, DPARM_SIZE, 1 >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< double, DPARM_SIZE, 1 >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< double, DPARM_SIZE, 1 >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< double, DPARM_SIZE, 1 >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< double, DPARM_SIZE, 1 >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< double, UMFPACK_CONTROL, 1 >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< double, UMFPACK_INFO, 1 >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< double, UMFPACK_INFO, 1 >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< double, UMFPACK_INFO, 1 >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< double, UMFPACK_INFO, 1 >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< double, UMFPACK_INFO, 1 >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< Index, 1, Dynamic >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< Index, 1, Dynamic >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< Index, 1, Dynamic >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< Index, 1, Dynamic >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< Index, 1, Dynamic >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< Index, 1, Dynamic >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< Index, 1, Dynamic >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< Index, 1, Dynamic >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< Index, 1, Dynamic >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< Index, 1, Dynamic >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< Index, 1, Dynamic >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< Index, 1, Dynamic >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< int, IPARM_SIZE, 1 >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< int, IPARM_SIZE, 1 >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< int, IPARM_SIZE, 1 >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< int, IPARM_SIZE, 1 >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< int, IPARM_SIZE, 1 >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< int, IPARM_SIZE, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< int, IPARM_SIZE, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< int, IPARM_SIZE, 1 >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< int, IPARM_SIZE, 1 >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< int, IPARM_SIZE, 1 >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< int, IPARM_SIZE, 1 >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< int, IPARM_SIZE, 1 >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< RealScalar, Dynamic, 1 >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< RealScalar, Dynamic, 1 >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< RealScalar, Dynamic, 1 >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< RealScalar, Dynamic, 1 >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< RealScalar, Dynamic, 1 >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< RealScalar, Dynamic, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< RealScalar, Dynamic, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< RealScalar, Dynamic, 1 >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< RealScalar, Dynamic, 1 >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< RealScalar, Dynamic, 1 >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< RealScalar, Dynamic, 1 >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< RealScalar, Dynamic, 1 >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< StorageIndex, 2, 1 >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< StorageIndex, 2, 1 >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< StorageIndex, 2, 1 >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< StorageIndex, 2, 1 >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< StorageIndex, 2, 1 >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< StorageIndex, 2, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< StorageIndex, 2, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< StorageIndex, 2, 1 >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< StorageIndex, 2, 1 >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< StorageIndex, 2, 1 >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< StorageIndex, 2, 1 >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< StorageIndex, 2, 1 >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< StorageIndex, 64, 1, DontAlign >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(Index rows, Index cols)']]], - ['array_579',['array',['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1cudev_1_1ArrayWrapper.html#a306fd296d76159d85ca6d90f4741ce9f',1,'cv::cudev::ArrayWrapper::array'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a354c33eec32ceb4193d002f4d41c0497',1,'Eigen::MatrixBase::array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a72f287fe7b2a7e7a66d16cc88166d47f',1,'Eigen::MatrixBase::array() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a354c33eec32ceb4193d002f4d41c0497',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a72f287fe7b2a7e7a66d16cc88166d47f',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::array() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a354c33eec32ceb4193d002f4d41c0497',1,'MatrixBase< Solve< Decomposition, RhsType > >::array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a72f287fe7b2a7e7a66d16cc88166d47f',1,'MatrixBase< Solve< Decomposition, RhsType > >::array() const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a2c8d8f5741aedadac8f3bffd8f2ce13e.html#a2c8d8f5741aedadac8f3bffd8f2ce13e',1,'nlohmann::basic_json::array()']]], - ['array_20class_20and_20coefficient_20wise_20operations_580',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], - ['array_20creation_20functions_581',['Array creation functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01523.html',1,'']]], - ['array_20manipulation_582',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], - ['array_20typedefs_583',['Global array typedefs',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html',1,'']]], - ['array2_584',['Array2',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga27e36e9e1da10f2c17d69bbfa7ead870',1,'Eigen::Array2'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga27e36e9e1da10f2c17d69bbfa7ead870',1,'Array2(Global Namespace)']]], - ['array22_585',['Array22',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gad5e10990863f064300d78e80b4537a0b',1,'Eigen::Array22'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gad5e10990863f064300d78e80b4537a0b',1,'Array22(Global Namespace)']]], - ['array2x_586',['Array2X',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga995df558b61646d505b9feabd30a28d0',1,'Eigen::Array2X'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga995df558b61646d505b9feabd30a28d0',1,'Array2X(Global Namespace)']]], - ['array3_587',['Array3',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga7ca781ec91d7b715d226d5057d50b250',1,'Eigen::Array3'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga7ca781ec91d7b715d226d5057d50b250',1,'Array3(Global Namespace)']]], - ['array33_588',['Array33',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gafb8560ef95ce6a7284131d91da82cf8a',1,'Eigen::Array33'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gafb8560ef95ce6a7284131d91da82cf8a',1,'Array33(Global Namespace)']]], - ['array3x_589',['Array3X',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gaf24f8bd443138027dd02599e7c58ef60',1,'Eigen::Array3X'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gaf24f8bd443138027dd02599e7c58ef60',1,'Array3X(Global Namespace)']]], - ['array4_590',['Array4',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga2b5e91e45a496f9893059ab4f298a9ee',1,'Eigen::Array4'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga2b5e91e45a496f9893059ab4f298a9ee',1,'Array4(Global Namespace)']]], - ['array44_591',['Array44',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gabcb97c1d614be824fd355ca29632e30f',1,'Eigen::Array44'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gabcb97c1d614be824fd355ca29632e30f',1,'Array44(Global Namespace)']]], - ['array4x_592',['Array4X',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gaab59985198663295e89134835783bd0d',1,'Eigen::Array4X'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gaab59985198663295e89134835783bd0d',1,'Array4X(Global Namespace)']]], - ['array_3c_20dim_20_3e_593',['Array< dim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'Eigen']]], - ['array_3c_20double_2c_20dparm_5fsize_2c_201_20_3e_594',['Array< double, DPARM_SIZE, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], - ['array_3c_20double_2c_20umfpack_5fcontrol_2c_201_20_3e_595',['Array< double, UMFPACK_CONTROL, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], - ['array_3c_20double_2c_20umfpack_5finfo_2c_201_20_3e_596',['Array< double, UMFPACK_INFO, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], - ['array_3c_20filters_3a_3aoutput_2c_20numoutputs_20_3e_597',['array< filters::Output, numOutputs >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01703.html',1,'std']]], - ['array_3c_20index_2c_201_2c_20dynamic_20_3e_598',['Array< Index, 1, Dynamic >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], - ['array_3c_20int_2c_20iparm_5fsize_2c_201_20_3e_599',['Array< int, IPARM_SIZE, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], - ['array_3c_20n_20_3e_600',['Array< N >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'Eigen']]], - ['array_3c_20realscalar_2c_20dynamic_2c_201_20_3e_601',['Array< RealScalar, Dynamic, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], - ['array_3c_20storageindex_2c_202_2c_201_20_3e_602',['Array< StorageIndex, 2, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], - ['array_3c_20storageindex_2c_2064_2c_201_2c_20dontalign_20_3e_603',['Array< StorageIndex, 64, 1, DontAlign >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], - ['array_5fallocator_604',['array_allocator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10251.html',1,'__gnu_cxx']]], - ['array_5fallocator_2eh_605',['array_allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01028.html',1,'']]], - ['array_5fallocator_5fbase_606',['array_allocator_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10247.html',1,'__gnu_cxx']]], - ['array_5fbuffer_607',['ARRAY_BUFFER',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a830568a629457171cb07918537ec66bea62a4126c42da95e41facc4f84475f44a',1,'cv::ogl::Buffer']]], - ['array_5ft_608',['array_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a858c1cf8407bc06494e3a1114a3b73e7.html#a858c1cf8407bc06494e3a1114a3b73e7',1,'nlohmann::basic_json']]], - ['arraybase_609',['ArrayBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html',1,'Eigen']]], - ['arraybase_3c_20arraywrapper_3c_20expressiontype_20_3e_20_3e_610',['ArrayBase< ArrayWrapper< ExpressionType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html',1,'']]], - ['arrayint_611',['arrayInt',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#ab87209295a63ac51a40129074c08546e',1,'cv::dnn::DictValue']]], - ['arrayreal_612',['arrayReal',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a904c466e944eecf6683d5bba8d89984c',1,'cv::dnn::DictValue']]], - ['arrays_613',['Arrays',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html',1,'cv::ogl']]], - ['arrays_614',['arrays',['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a001ac5692124eefacd223ab4c26a430f',1,'cv::NAryMatIterator']]], - ['arrays_615',['Arrays',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#ad7084cc4c4d8f6a6b381480088fea7e7',1,'cv::ogl::Arrays']]], - ['arrays_616',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], - ['arrays_617',['Numeric Arrays',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html',1,'']]], - ['arrays_618',['Operations on arrays',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html',1,'']]], - ['arraystring_619',['arrayString',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a80564c784d4513f070a60f781b8d7c58',1,'cv::dnn::DictValue']]], - ['arraywrapper_620',['ArrayWrapper',['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1cudev_1_1ArrayWrapper.html',1,'cv::cudev::ArrayWrapper< class, COUNT >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayWrapper.html',1,'Eigen::ArrayWrapper< class >']]], - ['arrayx_621',['ArrayX',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga9f9db3ea1c9715a30ed77c6cd434bbd3',1,'Eigen::ArrayX'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga9f9db3ea1c9715a30ed77c6cd434bbd3',1,'ArrayX(Global Namespace)']]], - ['arrayx2_622',['ArrayX2',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga273e82d1306290af7e02aeb75a831fca',1,'Eigen::ArrayX2'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga273e82d1306290af7e02aeb75a831fca',1,'ArrayX2(Global Namespace)']]], - ['arrayx3_623',['ArrayX3',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga428c78ad433d2f285650ccee8fc0f29f',1,'Eigen::ArrayX3'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga428c78ad433d2f285650ccee8fc0f29f',1,'ArrayX3(Global Namespace)']]], - ['arrayx4_624',['ArrayX4',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gaad02550dee7a18c7a74941be73de327d',1,'Eigen::ArrayX4'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gaad02550dee7a18c7a74941be73de327d',1,'ArrayX4(Global Namespace)']]], - ['arrayxpr_625',['ArrayXpr',['https://eigen.tuxfamily.org/dox/structEigen_1_1ArrayXpr.html',1,'Eigen']]], - ['arrayxx_626',['ArrayXX',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga6a3ca2b2a8694c17ed25ac03cafdaa04',1,'Eigen::ArrayXX'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga6a3ca2b2a8694c17ed25ac03cafdaa04',1,'ArrayXX(Global Namespace)']]], - ['arrowedline_627',['arrowedLine',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga0a165a3ca093fd488ac709fdf10c05b2',1,'cv::arrowedLine()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga0a165a3ca093fd488ac709fdf10c05b2',1,'arrowedLine(InputOutputArray img, Point pt1, Point pt2, const Scalar &color, int thickness=1, int line_type=8, int shift=0, double tipLength=0.1)(Global Namespace)']]], - ['aruco_20and_20charuco_628',['Calibration with ArUco and ChArUco',['https://docs.opencv.org/4.2.0/da/d13/tutorial_aruco_calibration.html',1,'']]], - ['aruco_20boards_629',['Detection of ArUco Boards',['https://docs.opencv.org/4.2.0/db/da9/tutorial_aruco_board_detection.html',1,'']]], - ['aruco_20marker_20detection_630',['ArUco Marker Detection',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html',1,'']]], - ['aruco_20marker_20detection_20aruco_20module_631',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], - ['aruco_20markers_632',['Detection of ArUco Markers',['https://docs.opencv.org/4.2.0/d5/dae/tutorial_aruco_detection.html',1,'']]], - ['aruco_20module_633',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], - ['aruco_20module_20faq_634',['Aruco module FAQ',['https://docs.opencv.org/4.2.0/d1/dcb/tutorial_aruco_faq.html',1,'']]], - ['aruco_2ehpp_635',['aruco.hpp',['https://docs.opencv.org/4.2.0/d9/d53/aruco_8hpp.html',1,'']]], - ['aruco_5fboard_5fdetection_2emarkdown_636',['aruco_board_detection.markdown',['https://docs.opencv.org/4.2.0/de/d6c/aruco__board__detection_8markdown.html',1,'']]], - ['aruco_5fcalibration_2emarkdown_637',['aruco_calibration.markdown',['https://docs.opencv.org/4.2.0/d6/d1e/aruco__calibration_8markdown.html',1,'']]], - ['aruco_5fdetection_2emarkdown_638',['aruco_detection.markdown',['https://docs.opencv.org/4.2.0/db/d20/aruco__detection_8markdown.html',1,'']]], - ['aruco_5ffaq_2emarkdown_639',['aruco_faq.markdown',['https://docs.opencv.org/4.2.0/da/d22/aruco__faq_8markdown.html',1,'']]], - ['as_20a_20paint_20brush_640',['Mouse as a Paint-Brush',['https://docs.opencv.org/4.2.0/db/d5b/tutorial_py_mouse_handling.html',1,'']]], - ['as_20parameters_641',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], - ['as_20the_20color_20palette_642',['Trackbar as the Color Palette',['https://docs.opencv.org/4.2.0/d9/dc8/tutorial_py_trackbar.html',1,'']]], - ['as_5fis_643',['AS_IS',['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#af76d4f81be079787300899fbfaaf92d3a3aa37e46f04bc8e707fca72d592023eb',1,'cv::detail::Timelapser']]], - ['ascii_644',['ascii',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a5b53c2c5ad9b511c364628ec7ddeccf1',1,'cv::QtFont']]], - ['asdiagonal_645',['asDiagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a14235b62c90f93fe910070b4743782d0',1,'Eigen::MatrixBase::asDiagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a14235b62c90f93fe910070b4743782d0',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::asDiagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a14235b62c90f93fe910070b4743782d0',1,'MatrixBase< Solve< Decomposition, RhsType > >::asDiagonal()']]], - ['asgd_646',['ASGD',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#ab028695cc8ec1491888d8d03f80bc8c2abb41d794ce113aa2123f45120e8354af',1,'cv::ml::SVMSGD']]], - ['asin_647',['asin',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d46b675147054f73255bcba75d2ab2e',1,'cv::cudev::asin(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb2753cc55aa711c823538038b40d11b',1,'cv::cudev::asin(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63c8961b3773b34212feab8f14f1729c',1,'cv::cudev::asin(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d2e866011556264911b29da48da6018',1,'cv::cudev::asin(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f67153a2fd5eb29d198c0b99eeacffd',1,'cv::cudev::asin(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64b6a4a32fc7d97c581d984576601cf0',1,'cv::cudev::asin(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac99e4184ec869539d1280a6ad1393700',1,'cv::cudev::asin(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafffa8116a049d289c27af484c6f3421f',1,'cv::cudev::asin(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga119b8d3ac04d54cee8efdd520ed3c132',1,'cv::cudev::asin(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a5c23e79ad43591812ac9ed61807868',1,'cv::cudev::asin(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7a28532390be9aa4666ffbc0a1a8808',1,'cv::cudev::asin(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac673b4c0ee7fde2752d6b86c755cb095',1,'cv::cudev::asin(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e94eafb3f81815fa021af5082a3ce37',1,'cv::cudev::asin(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f3aefa0e51d807a1f87dfbef16deef9',1,'cv::cudev::asin(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabffd5eab69bbbc638f72684a3d3fff00',1,'cv::cudev::asin(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70e9468af3ef289f268f1676722d8406',1,'cv::cudev::asin(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c73156810c59fbc6e615b67bb648573',1,'cv::cudev::asin(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73714fb2c8eb5e087d8c87fbebed0407',1,'cv::cudev::asin(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c097cab8ed2db0d2438670a6f0bbec1',1,'cv::cudev::asin(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga099c63fbc8aecbf8634d6692e53773b8',1,'cv::cudev::asin(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1a956b44859dd3247028efb751fb48b',1,'cv::cudev::asin(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab79a285c3d833cf267899dd5e8e60633',1,'cv::cudev::asin(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92825e462c1965828eee02edd9090177',1,'cv::cudev::asin(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc49fada95c5ce84d80b0df9c3d8834f',1,'cv::cudev::asin(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e26fb2a948b29029faf17f9c3a78311',1,'cv::cudev::asin(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac068b5ae5ba49af36f0d3d769c940309',1,'cv::cudev::asin(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa996799ef9bbfadeb14f7b8b966bc50c',1,'cv::cudev::asin(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8415495cd60820deb62bb62c64db5e9',1,'cv::cudev::asin(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49f25e71abd12478dc823ca2abd97d3f',1,'cv::cudev::asin(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d181b76005b39f7261d703b4c2c0428',1,'cv::cudev::asin(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3781726cc650d01884d17b09768f5015',1,'cv::cudev::asin(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga181b9599b639820b0402e7d73f89091a',1,'cv::cudev::asin(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d46b675147054f73255bcba75d2ab2e',1,'asin(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb2753cc55aa711c823538038b40d11b',1,'asin(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63c8961b3773b34212feab8f14f1729c',1,'asin(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d2e866011556264911b29da48da6018',1,'asin(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f67153a2fd5eb29d198c0b99eeacffd',1,'asin(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64b6a4a32fc7d97c581d984576601cf0',1,'asin(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac99e4184ec869539d1280a6ad1393700',1,'asin(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafffa8116a049d289c27af484c6f3421f',1,'asin(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga119b8d3ac04d54cee8efdd520ed3c132',1,'asin(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a5c23e79ad43591812ac9ed61807868',1,'asin(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7a28532390be9aa4666ffbc0a1a8808',1,'asin(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac673b4c0ee7fde2752d6b86c755cb095',1,'asin(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e94eafb3f81815fa021af5082a3ce37',1,'asin(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f3aefa0e51d807a1f87dfbef16deef9',1,'asin(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabffd5eab69bbbc638f72684a3d3fff00',1,'asin(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70e9468af3ef289f268f1676722d8406',1,'asin(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c73156810c59fbc6e615b67bb648573',1,'asin(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73714fb2c8eb5e087d8c87fbebed0407',1,'asin(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c097cab8ed2db0d2438670a6f0bbec1',1,'asin(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga099c63fbc8aecbf8634d6692e53773b8',1,'asin(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1a956b44859dd3247028efb751fb48b',1,'asin(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab79a285c3d833cf267899dd5e8e60633',1,'asin(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92825e462c1965828eee02edd9090177',1,'asin(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc49fada95c5ce84d80b0df9c3d8834f',1,'asin(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e26fb2a948b29029faf17f9c3a78311',1,'asin(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac068b5ae5ba49af36f0d3d769c940309',1,'asin(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa996799ef9bbfadeb14f7b8b966bc50c',1,'asin(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8415495cd60820deb62bb62c64db5e9',1,'asin(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49f25e71abd12478dc823ca2abd97d3f',1,'asin(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d181b76005b39f7261d703b4c2c0428',1,'asin(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3781726cc650d01884d17b09768f5015',1,'asin(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga181b9599b639820b0402e7d73f89091a',1,'asin(const double1 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af94e28dea7bd5b71959fbc6be1070895',1,'std::asin()'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a6c5c246b877ac331495d21e7a5d51616',1,'Eigen::asin()']]], - ['asin_5f_648',['asin_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b197e2eb35f84ac96c413917b4893f2',1,'cv::cudev::asin_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b197e2eb35f84ac96c413917b4893f2',1,'asin_()(Global Namespace)']]], - ['asin_5ffunc_649',['asin_func',['https://docs.opencv.org/4.2.0/d9/dee/structcv_1_1cudev_1_1asin__func.html',1,'cv::cudev']]], - ['asin_5ffunc_3c_20double_20_3e_650',['asin_func< double >',['https://docs.opencv.org/4.2.0/d6/d59/structcv_1_1cudev_1_1asin__func_3_01double_01_4.html',1,'cv::cudev']]], - ['asin_5ffunc_3c_20float_20_3e_651',['asin_func< float >',['https://docs.opencv.org/4.2.0/d5/d96/structcv_1_1cudev_1_1asin__func_3_01float_01_4.html',1,'cv::cudev']]], - ['asin_5ffunc_3c_20schar_20_3e_652',['asin_func< schar >',['https://docs.opencv.org/4.2.0/d9/da3/structcv_1_1cudev_1_1asin__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['asin_5ffunc_3c_20short_20_3e_653',['asin_func< short >',['https://docs.opencv.org/4.2.0/d1/d16/structcv_1_1cudev_1_1asin__func_3_01short_01_4.html',1,'cv::cudev']]], - ['asin_5ffunc_3c_20uchar_20_3e_654',['asin_func< uchar >',['https://docs.opencv.org/4.2.0/da/d71/structcv_1_1cudev_1_1asin__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['asin_5ffunc_3c_20uint_20_3e_655',['asin_func< uint >',['https://docs.opencv.org/4.2.0/d7/d65/structcv_1_1cudev_1_1asin__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['asin_5ffunc_3c_20ushort_20_3e_656',['asin_func< ushort >',['https://docs.opencv.org/4.2.0/d1/d46/structcv_1_1cudev_1_1asin__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['asinh_657',['asinh',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8efaf691d9c74b362a43b1b793706ea1',1,'Eigen::MatrixBase::asinh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8efaf691d9c74b362a43b1b793706ea1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::asinh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8efaf691d9c74b362a43b1b793706ea1',1,'MatrixBase< Solve< Decomposition, RhsType > >::asinh()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbd44b57c61d92a19c2f1c0a3eea904b',1,'cv::cudev::asinh(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3efff6ed67ee0a099661c85d6857d60e',1,'cv::cudev::asinh(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8da92b6ef8c1631bfbb45735a9148e6',1,'cv::cudev::asinh(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac02b7c2e2106fb1e0f80643c10bd2cf6',1,'cv::cudev::asinh(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fd4981a7d9be01ea405b55431827410',1,'cv::cudev::asinh(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga632bac3bc491416ce1ea446a2f00b987',1,'cv::cudev::asinh(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5141b961093114d2403503fd91450119',1,'cv::cudev::asinh(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6c3aeea0ac7fecbb340c3dc17c90afd',1,'cv::cudev::asinh(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59a473e70af307dd88d10a623e10e701',1,'cv::cudev::asinh(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9e8311550bead336d93a88067bc01a6',1,'cv::cudev::asinh(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4095d6f79c02f60405f7ace4591b2a08',1,'cv::cudev::asinh(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b36f34a780166b3a28603ea8daf2945',1,'cv::cudev::asinh(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1bda833fdfe3bbd7ca67cac28b76158',1,'cv::cudev::asinh(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395725ba1a3f3f138834c6dbca55a261',1,'cv::cudev::asinh(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f2706206f5121113e535b8188245459',1,'cv::cudev::asinh(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b7fc019908070e31838d0b9cae21d0f',1,'cv::cudev::asinh(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b051dcc3d2aa43bbb19bdc9c1fc9921',1,'cv::cudev::asinh(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga091506e5fe8a4ef0274ffef7af553f51',1,'cv::cudev::asinh(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f5dade9e6299b9fe8befbecd65c5c2',1,'cv::cudev::asinh(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga583369524722ea3d3909fab1658a2526',1,'cv::cudev::asinh(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga899821e3a4aac460c4ba2ea7b3162ffb',1,'cv::cudev::asinh(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga352dae34f3bd33ad2b4c424e11f5a107',1,'cv::cudev::asinh(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace822c9a93f63fda202e490665c562aa',1,'cv::cudev::asinh(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd2b0277e482d96d5448688b01472f93',1,'cv::cudev::asinh(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c783ad414f1188af62dc76ec789e134',1,'cv::cudev::asinh(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf0c6a0db0c74d45bd1611ab73b0fb3a',1,'cv::cudev::asinh(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebd050be09fca79f1f2a4539e2c5e21a',1,'cv::cudev::asinh(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157bf56136ef621f607a321bfc8153c4',1,'cv::cudev::asinh(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034295abeff6dbf5ce8bc1acf081ea7e',1,'cv::cudev::asinh(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9a1236429d0d60cfaf181900531bd7f',1,'cv::cudev::asinh(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ff90e7522c57f55d75dc4016ff82d51',1,'cv::cudev::asinh(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga729ef6c6dd550b9a1da561af542f5caf',1,'cv::cudev::asinh(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbd44b57c61d92a19c2f1c0a3eea904b',1,'asinh(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3efff6ed67ee0a099661c85d6857d60e',1,'asinh(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8da92b6ef8c1631bfbb45735a9148e6',1,'asinh(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac02b7c2e2106fb1e0f80643c10bd2cf6',1,'asinh(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fd4981a7d9be01ea405b55431827410',1,'asinh(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga632bac3bc491416ce1ea446a2f00b987',1,'asinh(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5141b961093114d2403503fd91450119',1,'asinh(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6c3aeea0ac7fecbb340c3dc17c90afd',1,'asinh(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59a473e70af307dd88d10a623e10e701',1,'asinh(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9e8311550bead336d93a88067bc01a6',1,'asinh(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4095d6f79c02f60405f7ace4591b2a08',1,'asinh(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b36f34a780166b3a28603ea8daf2945',1,'asinh(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1bda833fdfe3bbd7ca67cac28b76158',1,'asinh(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395725ba1a3f3f138834c6dbca55a261',1,'asinh(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f2706206f5121113e535b8188245459',1,'asinh(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b7fc019908070e31838d0b9cae21d0f',1,'asinh(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b051dcc3d2aa43bbb19bdc9c1fc9921',1,'asinh(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga091506e5fe8a4ef0274ffef7af553f51',1,'asinh(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f5dade9e6299b9fe8befbecd65c5c2',1,'asinh(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga583369524722ea3d3909fab1658a2526',1,'asinh(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga899821e3a4aac460c4ba2ea7b3162ffb',1,'asinh(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga352dae34f3bd33ad2b4c424e11f5a107',1,'asinh(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace822c9a93f63fda202e490665c562aa',1,'asinh(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd2b0277e482d96d5448688b01472f93',1,'asinh(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c783ad414f1188af62dc76ec789e134',1,'asinh(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf0c6a0db0c74d45bd1611ab73b0fb3a',1,'asinh(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebd050be09fca79f1f2a4539e2c5e21a',1,'asinh(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157bf56136ef621f607a321bfc8153c4',1,'asinh(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034295abeff6dbf5ce8bc1acf081ea7e',1,'asinh(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9a1236429d0d60cfaf181900531bd7f',1,'asinh(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ff90e7522c57f55d75dc4016ff82d51',1,'asinh(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga729ef6c6dd550b9a1da561af542f5caf',1,'asinh(const double1 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2135f46a5a1fcc1cd3399ef4e20f6249',1,'std::asinh()'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a727dd851cc82a62574145bc5abdc7aed',1,'Eigen::asinh()']]], - ['asinh_5f_658',['asinh_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b664c30c6d7e3a2e7718ee996979978',1,'cv::cudev::asinh_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b664c30c6d7e3a2e7718ee996979978',1,'asinh_()(Global Namespace)']]], - ['asinh_5ffunc_659',['asinh_func',['https://docs.opencv.org/4.2.0/d0/d43/structcv_1_1cudev_1_1asinh__func.html',1,'cv::cudev']]], - ['asinh_5ffunc_3c_20double_20_3e_660',['asinh_func< double >',['https://docs.opencv.org/4.2.0/d7/da8/structcv_1_1cudev_1_1asinh__func_3_01double_01_4.html',1,'cv::cudev']]], - ['asinh_5ffunc_3c_20float_20_3e_661',['asinh_func< float >',['https://docs.opencv.org/4.2.0/d1/d1c/structcv_1_1cudev_1_1asinh__func_3_01float_01_4.html',1,'cv::cudev']]], - ['asinh_5ffunc_3c_20schar_20_3e_662',['asinh_func< schar >',['https://docs.opencv.org/4.2.0/db/db5/structcv_1_1cudev_1_1asinh__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['asinh_5ffunc_3c_20short_20_3e_663',['asinh_func< short >',['https://docs.opencv.org/4.2.0/df/da7/structcv_1_1cudev_1_1asinh__func_3_01short_01_4.html',1,'cv::cudev']]], - ['asinh_5ffunc_3c_20uchar_20_3e_664',['asinh_func< uchar >',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1cudev_1_1asinh__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['asinh_5ffunc_3c_20uint_20_3e_665',['asinh_func< uint >',['https://docs.opencv.org/4.2.0/d6/d27/structcv_1_1cudev_1_1asinh__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['asinh_5ffunc_3c_20ushort_20_3e_666',['asinh_func< ushort >',['https://docs.opencv.org/4.2.0/d6/dc2/structcv_1_1cudev_1_1asinh__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['asinterleaved_667',['asInterleaved',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#ac7d2267acbbc949cf82a5d35b6942847',1,'cv::GMatDesc']]], - ['asked_20questions_668',['Frequently Asked Questions',['https://docs.opencv.org/4.2.0/d3/d2d/faq.html',1,'']]], - ['aspect_669',['aspect',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#af75930059b53838d8d65ae8b677840da',1,'cv::detail::CameraParams']]], - ['aspectratio_670',['aspectRatio',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2b608524f19d01184e6e954b976e102f',1,'cv::Size_::aspectRatio()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2b608524f19d01184e6e954b976e102f',1,'Size_< float >::aspectRatio()']]], - ['asplanar_671',['asPlanar',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#ac3db4ce0b4c2bc2a9c7931b1898c90f6',1,'cv::GMatDesc::asPlanar() const'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a47e313dd951214fbe2469a956af24944',1,'cv::GMatDesc::asPlanar(int planes) const']]], - ['assert_2ehpp_672',['assert.hpp',['https://docs.opencv.org/4.2.0/d2/d54/assert_8hpp.html',1,'']]], - ['assert_5fpredictions_673',['assert_predictions',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a7934b3d0aeb136e71abf2f410230d113',1,'cv::dnn_objdetect::InferBbox']]], - ['assertion_20on_20unaligned_20arrays_674',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], - ['assertions_675',['Assertions',['https://eigen.tuxfamily.org/dox/TopicAssertions.html',1,'']]], - ['assertions_2eh_676',['assertions.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00749.html',1,'']]], - ['asserttest_677',['assertTest',['https://docs.opencv.org/4.2.0/d0/d93/structNcvCTprep_1_1assertTest.html',1,'NcvCTprep']]], - ['assign_678',['assign',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a6aeb30bb97609c10c16b76952fb1715c',1,'cv::_OutputArray::assign(const UMat &u) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ab1c94d2b81fca98114fca897f71f83ee',1,'cv::_OutputArray::assign(const Mat &m) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a6cb7978cd5415cefa1656bb3156b138d',1,'cv::_OutputArray::assign(const std::vector< UMat > &v) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#abd47d94d5cc2cc5889e3ae61a9f84472',1,'cv::_OutputArray::assign(const std::vector< Mat > &v) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#af439e10effa2d7f7c093b194f563e8fd',1,'cv::cudev::GpuMat_::assign()'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a655357fd7395545f8e16638fe53678d0',1,'cv::MatOp::assign()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2f8201f5e82e07e27c2f39f13a1c04a9',1,'__gnu_cxx::__versa_string::assign(const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a34d8c156d115ee2ee8ec527d324581b1',1,'__gnu_cxx::__versa_string::assign(__versa_string &&__str) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab5ba7120a3e81545fcbdbf055c8e392d',1,'__gnu_cxx::__versa_string::assign(const __versa_string &__str, size_type __pos, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a861c4286beece654abd5b3a828f4ff49',1,'__gnu_cxx::__versa_string::assign(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9faa9dc311635300ef2e2fee77262b61',1,'__gnu_cxx::__versa_string::assign(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#acf5a7b1fd517200f124373026b7bd807',1,'__gnu_cxx::__versa_string::assign(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a0cd3b8029b8958b6f02852e240b50899',1,'__gnu_cxx::__versa_string::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab375104c3d2ef95f7d2b56a25d91bef8',1,'__gnu_cxx::__versa_string::assign(std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'__gnu_debug::basic_string::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'__gnu_debug::basic_string::assign(basic_string &&__str) noexcept(allocator_traits< _Allocator >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'__gnu_debug::basic_string::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< _CharT >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< _CharT >::assign(basic_string &&__str) noexcept(allocator_traits< _Alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< _CharT >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< _CharT >::assign(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< _CharT >::assign(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< _CharT >::assign(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< _CharT >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< _CharT >::assign(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< _CharT, _Traits, _Allocator >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< _CharT, _Traits, _Allocator >::assign(basic_string &&__str) noexcept(allocator_traits< _Allocator >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< _CharT, _Traits, _Allocator >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< _CharT, _Traits, _Allocator >::assign(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< _CharT, _Traits, _Allocator >::assign(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< _CharT, _Traits, _Allocator >::assign(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< _CharT, _Traits, _Allocator >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< _CharT, _Traits, _Allocator >::assign(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(basic_string &&__str) noexcept(allocator_traits< _Wide_alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(const _Elem *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(size_type __n, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< char >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< char >::assign(basic_string &&__str) noexcept(allocator_traits< _Alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< char >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< char >::assign(const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< char >::assign(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< char >::assign(size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< char >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< char >::assign(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(basic_string &&__str) noexcept(allocator_traits< _Byte_alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< char_type, _Traits, _Alloc >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< char_type, _Traits, _Alloc >::assign(basic_string &&__str) noexcept(allocator_traits< _Alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< char_type, _Traits, _Alloc >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< char_type, _Traits, _Alloc >::assign(const char_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< char_type, _Traits, _Alloc >::assign(const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< char_type, _Traits, _Alloc >::assign(size_type __n, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< char_type, _Traits, _Alloc >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< char_type, _Traits, _Alloc >::assign(initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< value_type >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< value_type >::assign(basic_string &&__str) noexcept(allocator_traits< _Alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< value_type >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< value_type >::assign(const value_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< value_type >::assign(const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< value_type >::assign(size_type __n, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< value_type >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< value_type >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a65dabc6e005b7b5a19adf55792821e76',1,'deque< _StateSeqT >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ac0579ff04738a923ad49b8b9398af642',1,'deque< _StateSeqT >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ab16028e538ba034ad569b6933c152cdb',1,'deque< _StateSeqT >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a9f1a22c8bd2a8d5ecacab44644f513db',1,'list< __inp, __rebind_inp >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a6527fbbec76ab1a8a4a80c04e6fcac70',1,'list< __inp, __rebind_inp >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a396193b1480defeaa5f3367ca15ec35e',1,'list< __inp, __rebind_inp >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'match_results< _Bi_iter >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'match_results< _Bi_iter >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'match_results< _Bi_iter >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a4c13f179b615747c4870a009f84fb490',1,'std::basic_regex::assign(const basic_regex &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a2208605216a89f7c0a64b642ec56b962',1,'std::basic_regex::assign(basic_regex &&__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#ac2ebaaabe81e6b5b5d54bee16fdd494c',1,'std::basic_regex::assign(const _Ch_type *__p, flag_type __flags=ECMAScript)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a133cf9c18a76a5c5b69bb464ec68015f',1,'std::basic_regex::assign(const _Ch_type *__p, std::size_t __len, flag_type __flags)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a12b699dc147fc74d3882e6b661be3337',1,'std::basic_regex::assign(const basic_string< _Ch_type, _Ch_traits, _Alloc > &__s, flag_type __flags=ECMAScript)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#ac731050f58a6f3ec7fc94fd80139fb7e',1,'std::basic_regex::assign(_InputIterator __first, _InputIterator __last, flag_type __flags=ECMAScript)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a2856446d7ccd20e377e2904faadcd87e',1,'std::basic_regex::assign(initializer_list< _Ch_type > __l, flag_type __flags=ECMAScript)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'std::basic_string::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'std::basic_string::assign(basic_string &&__str) noexcept(allocator_traits< _Alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'std::basic_string::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'std::basic_string::assign(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'std::basic_string::assign(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'std::basic_string::assign(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'std::basic_string::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'std::basic_string::assign(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a65dabc6e005b7b5a19adf55792821e76',1,'std::deque::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ac0579ff04738a923ad49b8b9398af642',1,'std::deque::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ab16028e538ba034ad569b6933c152cdb',1,'std::deque::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aaf0bffb70955f72cf2972e70155e13d2',1,'std::forward_list::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a834314c2bf6e162dab99f07f1d6c551d',1,'std::forward_list::assign(size_type __n, const _Tp &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#adcaa8789d2741f6b65603b41c8aba63f',1,'std::forward_list::assign(std::initializer_list< _Tp > __il)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a9f1a22c8bd2a8d5ecacab44644f513db',1,'std::list::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a6527fbbec76ab1a8a4a80c04e6fcac70',1,'std::list::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a396193b1480defeaa5f3367ca15ec35e',1,'std::list::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'std::match_results::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'std::match_results::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'std::match_results::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'std::vector::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'std::vector::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'std::vector::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< __diff_type >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< __diff_type >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< __diff_type >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _CharClassT >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _CharClassT >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _CharClassT >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _CharT >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _CharT >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _CharT >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _Cmpt >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _Cmpt >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _Cmpt >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _Node *, _Nodeptr_Alloc >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _Node *, _Nodeptr_Alloc >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _Node *, _Nodeptr_Alloc >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _RealType >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _RealType >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _RealType >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _State< _TraitsT::char_type > >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _State< _TraitsT::char_type > >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _State< _TraitsT::char_type > >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _StringT >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _StringT >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _StringT >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< block_type, allocator_type >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< block_type, allocator_type >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< block_type, allocator_type >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< Catalog_info * >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< Catalog_info * >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< Catalog_info * >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< double >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< double >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< double >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< int >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< int >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< int >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< result_type >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< result_type >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< result_type >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< size_t >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< size_t >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< size_t >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< std::pair< _BiIter, int > >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< std::pair< _BiIter, int > >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< std::pair< _BiIter, int > >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< std::pair< _StateIdT, std::vector > >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< std::pair< _StateIdT, std::vector > >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< std::pair< _StateIdT, std::vector > >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< std::pair< _StrTransT, _StrTransT > >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< std::pair< _StrTransT, _StrTransT > >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< std::pair< _StrTransT, _StrTransT > >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< sub_match< _Bi_iter >, _Alloc >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< sub_match< _Bi_iter >, _Alloc >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< sub_match< _Bi_iter >, _Alloc >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< sub_match< _BiIter >, _Alloc >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< sub_match< _BiIter >, _Alloc >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< sub_match< _BiIter >, _Alloc >::assign(initializer_list< value_type > __l)']]], - ['assign_5frow_679',['assign_row',['https://docs.opencv.org/4.2.0/d0/d06/namespacecv_1_1gapi_1_1own_1_1detail.html#ade6038d3a875aa1114b5ddeaaa696e79',1,'cv::gapi::own::detail']]], - ['assignto_680',['assignTo',['https://docs.opencv.org/4.2.0/d1/d0a/structcv_1_1cudev_1_1BinaryTransformPtrSz.html#a1c28e45877e56721c859a76c79652c71',1,'cv::cudev::BinaryTransformPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/dd/d49/structcv_1_1cudev_1_1CountNonZeroExprBody.html#ad465613d9f5946006ac34fb32613611e',1,'cv::cudev::CountNonZeroExprBody::assignTo()'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1cudev_1_1DerivXPtrSz.html#a3a9269d6dfcc69f51a3ed77ab1b3bedf',1,'cv::cudev::DerivXPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/d2/dfc/structcv_1_1cudev_1_1DerivYPtrSz.html#a993582f67a7d105f2b8bb5ac236a7cb8',1,'cv::cudev::DerivYPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/d9/d48/structcv_1_1cudev_1_1FindMaxValExprBody.html#acff08daea5a77493776db8cea26ec594',1,'cv::cudev::FindMaxValExprBody::assignTo()'],['https://docs.opencv.org/4.2.0/dd/db3/structcv_1_1cudev_1_1FindMinMaxValExprBody.html#a9d65da7120d96a494fdf01fa30c7d020',1,'cv::cudev::FindMinMaxValExprBody::assignTo()'],['https://docs.opencv.org/4.2.0/df/d82/structcv_1_1cudev_1_1FindMinValExprBody.html#a1b6d7c89f23af84b7621fbb403df1a2b',1,'cv::cudev::FindMinValExprBody::assignTo()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a03e76eb8993215020cff624ace66d7e6',1,'cv::cuda::GpuMat::assignTo()'],['https://docs.opencv.org/4.2.0/d9/dea/structcv_1_1cudev_1_1HistogramBody.html#af429d41ab0474d517c5befac92135df7',1,'cv::cudev::HistogramBody::assignTo()'],['https://docs.opencv.org/4.2.0/d3/dde/structcv_1_1cudev_1_1IntegralBody.html#a02c55aaaf7c505b578fcc3598a5d62ca',1,'cv::cudev::IntegralBody::assignTo()'],['https://docs.opencv.org/4.2.0/da/dd9/structcv_1_1cudev_1_1LaplacianPtrSz.html#ac0233702e954ba44e1ccc5d063241cc7',1,'cv::cudev::LaplacianPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/d5/d22/structcv_1_1cudev_1_1LutPtrSz.html#a6938b76f20af378a5328897b48f6cf5b',1,'cv::cudev::LutPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa8b3b4d7b9876a4726740b75daa98ddb',1,'cv::Mat::assignTo()'],['https://docs.opencv.org/4.2.0/d1/d8a/structcv_1_1cudev_1_1PyrDownBody.html#acba8f9bfb5e65d22fcee1630f949b903',1,'cv::cudev::PyrDownBody::assignTo()'],['https://docs.opencv.org/4.2.0/d1/de8/structcv_1_1cudev_1_1PyrUpBody.html#a550d44c816270ec4b39298c15b164d1e',1,'cv::cudev::PyrUpBody::assignTo()'],['https://docs.opencv.org/4.2.0/d5/df4/structcv_1_1cudev_1_1ReduceToColumnBody.html#a5968b92fd9324c04662ae4c924b5a1d8',1,'cv::cudev::ReduceToColumnBody::assignTo()'],['https://docs.opencv.org/4.2.0/da/d58/structcv_1_1cudev_1_1ReduceToRowBody.html#ad50d5168478eaa06984e8c13f59b0138',1,'cv::cudev::ReduceToRowBody::assignTo()'],['https://docs.opencv.org/4.2.0/dd/d03/structcv_1_1cudev_1_1RemapPtr1Sz.html#a68e72b778afc9b1bfebddb594e2f485f',1,'cv::cudev::RemapPtr1Sz::assignTo()'],['https://docs.opencv.org/4.2.0/d4/d59/structcv_1_1cudev_1_1RemapPtr2Sz.html#a3835cc862523a78e5fcb06fa3c2d3309',1,'cv::cudev::RemapPtr2Sz::assignTo()'],['https://docs.opencv.org/4.2.0/d3/d8a/structcv_1_1cudev_1_1ResizePtrSz.html#abe41fe80f4a491708011110e50a6fcb7',1,'cv::cudev::ResizePtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/d2/d88/structcv_1_1cudev_1_1ScharrXPtrSz.html#a142321c6f6267e273c2a2e25d12299d9',1,'cv::cudev::ScharrXPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/dd/def/structcv_1_1cudev_1_1ScharrYPtrSz.html#acbc7db67f57aaa5b4e2c439f184bb7c5',1,'cv::cudev::ScharrYPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1cudev_1_1SobelXPtrSz.html#a9eabceea8ece843309145bced287258e',1,'cv::cudev::SobelXPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/dd/dc6/structcv_1_1cudev_1_1SobelYPtrSz.html#ac3668092aa2a02fd0bfa3cd155fb39fc',1,'cv::cudev::SobelYPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ae102ac11f15a875d9b689575d585d21f',1,'cv::SparseMat::assignTo()'],['https://docs.opencv.org/4.2.0/dd/d33/structcv_1_1cudev_1_1SumExprBody.html#ad809e51dc955c25d4339229fd7e32345',1,'cv::cudev::SumExprBody::assignTo()'],['https://docs.opencv.org/4.2.0/d2/d40/structcv_1_1cudev_1_1TransposeBody.html#a14e6b573d82b37cff46690ee76bb7f07',1,'cv::cudev::TransposeBody::assignTo()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aef524a90c600f04e1cdd12788c608476',1,'cv::UMat::assignTo()'],['https://docs.opencv.org/4.2.0/d0/db7/structcv_1_1cudev_1_1UnaryTransformPtrSz.html#a7cb41f142cbf63b3101456c4762de6b3',1,'cv::cudev::UnaryTransformPtrSz::assignTo()']]], - ['assoc_5fcontainer_2ehpp_681',['assoc_container.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01115.html',1,'']]], - ['assoc_5flaguerre_682',['assoc_laguerre',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga377bb7e038c464a27dfe0573fd2d7b33',1,'std::assoc_laguerre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga41f206b7aaf85b07d45a66d68400a1a6',1,'std::tr1::assoc_laguerre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga377bb7e038c464a27dfe0573fd2d7b33',1,'assoc_laguerre(unsigned int __n, unsigned int __m, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga41f206b7aaf85b07d45a66d68400a1a6',1,'assoc_laguerre(unsigned int __n, unsigned int __m, _Tp __x)(Global Namespace)']]], - ['assoc_5flaguerref_683',['assoc_laguerref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf83d98f350a1cfcebee6a1f723cf90d2',1,'std::assoc_laguerref()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf83d98f350a1cfcebee6a1f723cf90d2',1,'assoc_laguerref()(Global Namespace)']]], - ['assoc_5flaguerrel_684',['assoc_laguerrel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gac8e245671fb2df5de5fd978d03081f6c',1,'std::assoc_laguerrel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gac8e245671fb2df5de5fd978d03081f6c',1,'assoc_laguerrel()(Global Namespace)']]], - ['assoc_5flegendre_685',['assoc_legendre',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga355349f79119c1fd1e2a9351cec57f0f',1,'std::assoc_legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga7cba5e4fcae2550e496bac5ce5347379',1,'std::tr1::assoc_legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga355349f79119c1fd1e2a9351cec57f0f',1,'assoc_legendre(unsigned int __l, unsigned int __m, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga7cba5e4fcae2550e496bac5ce5347379',1,'assoc_legendre(unsigned int __l, unsigned int __m, _Tp __x)(Global Namespace)']]], - ['assoc_5flegendref_686',['assoc_legendref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga3ced07ddd24bf4af56e2712d148e7f57',1,'std::assoc_legendref()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga3ced07ddd24bf4af56e2712d148e7f57',1,'assoc_legendref()(Global Namespace)']]], - ['assoc_5flegendrel_687',['assoc_legendrel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga55977b425a539146f060dec1c8003344',1,'std::assoc_legendrel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga55977b425a539146f060dec1c8003344',1,'assoc_legendrel(unsigned int __l, unsigned int __m, long double __x)(Global Namespace)']]], - ['associative_688',['Associative',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01471.html',1,'Associative'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01472.html',1,'Unordered Associative']]], - ['associative_5ftag_689',['associative_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11219.html',1,'__gnu_pbds']]], - ['assumption_20on_20stack_20alignment_690',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], - ['asymmetric_5fgrid_691',['ASYMMETRIC_GRID',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#ad83bbd88c4d01f670638e8ef4ffa6240a228f5c800931e5548a6eb45cd86cb0df',1,'cv::CirclesGridFinderParameters']]], - ['async_692',['async',['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#af0b613787bf7ad96ea630824bf042356',1,'cv::gapi::wip::async(GCompiled &gcmpld, std::function< void(std::exception_ptr)> &&callback, GRunArgs &&ins, GRunArgsP &&outs)'],['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#aef0be07fd8f46361642b6960846969c0',1,'cv::gapi::wip::async(GCompiled &gcmpld, std::function< void(std::exception_ptr)> &&callback, GRunArgs &&ins, GRunArgsP &&outs, GAsyncContext &ctx)'],['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#ac1e38f854b7b4820b9f82ebd51ba41a5',1,'cv::gapi::wip::async(GCompiled &gcmpld, GRunArgs &&ins, GRunArgsP &&outs)'],['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#adb9bd7fe80b6eee39f502c1185f902a4',1,'cv::gapi::wip::async(GCompiled &gcmpld, GRunArgs &&ins, GRunArgsP &&outs, GAsyncContext &ctx)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#gaf1fea595803dee7c5a4bc57bdcb433b5',1,'std::async(launch __policy, _Fn &&__fn, _Args &&... __args)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#gad8c32eea55b578ed51022e5607956064',1,'std::async(_Fn &&__fn, _Args &&... __args)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#gaf1fea595803dee7c5a4bc57bdcb433b5',1,'async(launch __policy, _Fn &&__fn, _Args &&... __args)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#gad8c32eea55b578ed51022e5607956064',1,'async(_Fn &&__fn, _Args &&... __args)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5ba0df93e34273b367bb63bad28c94c78d5',1,'async(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5ba0df93e34273b367bb63bad28c94c78d5',1,'async(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5ba0df93e34273b367bb63bad28c94c78d5',1,'async(Global Namespace)']]], - ['async_2ehpp_693',['async.hpp',['https://docs.opencv.org/4.2.0/d5/d2c/async_8hpp.html',1,'']]], - ['async_5fapply_694',['async_apply',['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#ac18191406996961abbc1f5060e08c510',1,'cv::gapi::wip::async_apply(GComputation &gcomp, std::function< void(std::exception_ptr)> &&callback, GRunArgs &&ins, GRunArgsP &&outs, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#af364608b2394086a446b58270d31024c',1,'cv::gapi::wip::async_apply(GComputation &gcomp, std::function< void(std::exception_ptr)> &&callback, GRunArgs &&ins, GRunArgsP &&outs, GCompileArgs &&args, GAsyncContext &ctx)'],['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#ad2b4cd2f672495907d53a395a17ec4c0',1,'cv::gapi::wip::async_apply(GComputation &gcomp, GRunArgs &&ins, GRunArgsP &&outs, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#a134f0f0dbb68c447fbd23f32c1ec100a',1,'cv::gapi::wip::async_apply(GComputation &gcomp, GRunArgs &&ins, GRunArgsP &&outs, GCompileArgs &&args, GAsyncContext &ctx)']]], - ['async_5fcleanup_695',['ASYNC_CLEANUP',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12accd8af313f75caee034b5f3ed25027a5',1,'cv::UMatData']]], - ['async_5fpromise_2ehpp_696',['async_promise.hpp',['https://docs.opencv.org/4.2.0/d6/dc4/async__promise_8hpp.html',1,'']]], - ['asyncarray_697',['AsyncArray',['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html',1,'cv::AsyncArray'],['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#ab70c3efa65213c3a099d7fec44c4c8cc',1,'cv::AsyncArray::AsyncArray() CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a31c5119610da24ab47a4eb117b77e8f1',1,'cv::AsyncArray::AsyncArray(const AsyncArray &o) CV_NOEXCEPT']]], - ['asyncarray_3a_3aimpl_698',['Impl',['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#aa7ee836a29c724a5f017b2f3b86a5abb',1,'cv::AsyncPromise']]], - ['asyncenginecount_699',['asyncEngineCount',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ae6f4cce774f4b4516923f78a3baa1910',1,'cv::cuda::DeviceInfo']]], - ['asynchronous_20api_700',['Asynchronous API',['https://docs.opencv.org/4.2.0/da/d57/group__core__async.html',1,'']]], - ['asynchronous_20c_20c_20converters_701',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], - ['asyncpromise_702',['AsyncPromise',['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html',1,'cv::AsyncPromise'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#acc0b836ba3b79227de551dd9d874f25b',1,'cv::AsyncPromise::AsyncPromise() CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#a89de2a6edad184c21c0ae16a4d6662a4',1,'cv::AsyncPromise::AsyncPromise(const AsyncPromise &o) CV_NOEXCEPT']]], - ['asynctask_703',['AsyncTask',['../classutil_1_1AsyncTask.html',1,'util::AsyncTask< Clock >'],['../classutil_1_1AsyncTask.html#a82a2d21ca436f4b4e148267029f7f175',1,'util::AsyncTask::AsyncTask()']]], - ['asynctask_3c_20std_3a_3achrono_3a_3asteady_5fclock_20_3e_704',['AsyncTask< std::chrono::steady_clock >',['../classutil_1_1AsyncTask.html',1,'util']]], - ['at_705',['at',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa5d20fc86d41d59e4d71ae93daee9726',1,'cv::Mat::at(int i0=0)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a330d9adb78976b6efd4116c940924294',1,'cv::Mat::at(int i0=0) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ac40425b84f60b39fd35e03814122661f',1,'cv::Mat::at(int row, int col)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a5db6b18954e334048cb35752f49c6f8c',1,'cv::Mat::at(int row, int col) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a305829ed5c0ecfef7b44db18953048e8',1,'cv::Mat::at(int i0, int i1, int i2)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a59c6c2d9db1cfba76d75addeeb4e6a84',1,'cv::Mat::at(int i0, int i1, int i2) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a474bd5cdcf986672cfdc304f6be1cf64',1,'cv::Mat::at(const int *idx)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a2cbbb16670ae4d9aa747f19c24305213',1,'cv::Mat::at(const int *idx) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a9ec1aadc17ab8c8f8334d521719c7732',1,'cv::Mat::at(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a15c649a94cf2e06240b32b025231301f',1,'cv::Mat::at(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a23cd599a27c59bae64b0c40ad645ea49',1,'cv::Mat::at(Point pt)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a87d0b2e01b0f8686957398ecfb168a6d',1,'cv::Mat::at(Point pt) const'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#ab78352fac82e9c22e0f8b3964ada27ca',1,'NCVMatrix::at()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a1dbcd4e782ab5ac789de302889097f4d',1,'__gnu_cxx::__versa_string::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a918448764b4f015d1ef5823415115db0',1,'__gnu_cxx::__versa_string::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'__gnu_debug::basic_string::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'__gnu_debug::basic_string::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< _CharT >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< _CharT >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< _CharT, _Traits, _Allocator >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< _CharT, _Traits, _Allocator >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< char >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< char >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< char, char_traits< char >, _Byte_alloc >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< char_type, _Traits, _Alloc >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< char_type, _Traits, _Alloc >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< value_type >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< value_type >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a4b0080ca0ed1a2222104a5fb776a454f',1,'deque< _StateSeqT >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a03a10b684468f787e852fa360440ba7b',1,'deque< _StateSeqT >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'match_results< _Bi_iter >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'match_results< _Bi_iter >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'std::basic_string::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'std::basic_string::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a4b0080ca0ed1a2222104a5fb776a454f',1,'std::deque::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a03a10b684468f787e852fa360440ba7b',1,'std::deque::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#aaf4942bb42ef39ce49cc232c06416f55',1,'std::map::at()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'std::match_results::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'std::match_results::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a801392267ec716837238015f8cefe60a',1,'std::unordered_map::at(const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a1f78ebfeb9bf55bc807a075eb22cb2aa',1,'std::unordered_map::at(const key_type &__k) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a801392267ec716837238015f8cefe60a',1,'std::unordered_map::at(const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a1f78ebfeb9bf55bc807a075eb22cb2aa',1,'std::unordered_map::at(const key_type &__k) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'std::vector::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'std::vector::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a801392267ec716837238015f8cefe60a',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::at(const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a1f78ebfeb9bf55bc807a075eb22cb2aa',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::at(const key_type &__k) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a801392267ec716837238015f8cefe60a',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::at(const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a1f78ebfeb9bf55bc807a075eb22cb2aa',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::at(const key_type &__k) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< __diff_type >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< __diff_type >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _CharClassT >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _CharClassT >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _CharT >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _CharT >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _Cmpt >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _Cmpt >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _Node *, _Nodeptr_Alloc >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _Node *, _Nodeptr_Alloc >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _RealType >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _RealType >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _State< _TraitsT::char_type > >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _State< _TraitsT::char_type > >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _StringT >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _StringT >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< block_type, allocator_type >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< block_type, allocator_type >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< Catalog_info * >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< Catalog_info * >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< double >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< double >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< int >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< int >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< result_type >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< result_type >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< size_t >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< size_t >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< std::pair< _BiIter, int > >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< std::pair< _BiIter, int > >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< std::pair< _StateIdT, std::vector > >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< std::pair< _StateIdT, std::vector > >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< std::pair< _StrTransT, _StrTransT > >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< std::pair< _StrTransT, _StrTransT > >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< sub_match< _Bi_iter >, _Alloc >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< sub_match< _Bi_iter >, _Alloc >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< sub_match< _BiIter >, _Alloc >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< sub_match< _BiIter >, _Alloc >::at(size_type __n) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a52b18a5b7e68652c65b070900c438c6e.html#a52b18a5b7e68652c65b070900c438c6e',1,'nlohmann::basic_json::at(size_type idx)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aeb18fe2b8a5dbff4ccf2848de854c3ac.html#aeb18fe2b8a5dbff4ccf2848de854c3ac',1,'nlohmann::basic_json::at(size_type idx) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a239e942da82f2597d0cf5ec806f5bc0d.html#a239e942da82f2597d0cf5ec806f5bc0d',1,'nlohmann::basic_json::at(const typename object_t::key_type &key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a229964ee10c92ba89ae4fba786fe6b50.html#a229964ee10c92ba89ae4fba786fe6b50',1,'nlohmann::basic_json::at(const typename object_t::key_type &key) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa014a978f8b6c085db8825faa8dad320.html#aa014a978f8b6c085db8825faa8dad320',1,'nlohmann::basic_json::at(const json_pointer &ptr)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a8284b9c1d4d0830151eaa000f907b2e6.html#a8284b9c1d4d0830151eaa000f907b2e6',1,'nlohmann::basic_json::at(const json_pointer &ptr) const'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_ab7b4bb185fe7ea84f8f5f32fd230ff91.html#ab7b4bb185fe7ea84f8f5f32fd230ff91',1,'nlohmann::ordered_map::at(const Key &key)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a8b7f27215180385b9b1e98adc4dd8ae7.html#a8b7f27215180385b9b1e98adc4dd8ae7',1,'nlohmann::ordered_map::at(const Key &key) const'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga64715f89ad837e2b6b5649d0f833172d',1,'cv::videostab::at(int idx, std::vector< T > &items)'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga45b7337858133cf230ad65a10c9ea63e',1,'cv::videostab::at(int idx, const std::vector< T > &items)'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga64715f89ad837e2b6b5649d0f833172d',1,'at(int idx, std::vector< T > &items)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga45b7337858133cf230ad65a10c9ea63e',1,'at(int idx, const std::vector< T > &items)(Global Namespace)']]], - ['atan_706',['atan',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76519038c10b0850b3cde04510e47628',1,'cv::cudev::atan(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab95a1eb1e568567f99a4a80c017543b',1,'cv::cudev::atan(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ff6e6613aa330d6879859b60fa249a9',1,'cv::cudev::atan(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3c05d20d386b1322b5113843962724d',1,'cv::cudev::atan(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6c4640461ed5be47b854d04c06a8e63',1,'cv::cudev::atan(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab727395d294da3a0dfb9bf9451f6b2ae',1,'cv::cudev::atan(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d35ea6aca3e67a1662eba95eda3fa8b',1,'cv::cudev::atan(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41ae7f410575919bd4ce075352044af7',1,'cv::cudev::atan(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40321639c1c78a1660232f1430ac5566',1,'cv::cudev::atan(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b5d932a4a1bb008ae867523a1bd74a7',1,'cv::cudev::atan(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76211c2027a8aa7e4155c3210425c95b',1,'cv::cudev::atan(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fc1bb772d4564dac7cd7cb0ed7df80b',1,'cv::cudev::atan(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d0c7779cc0f9a79c8073e1437d2e8e',1,'cv::cudev::atan(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab00d9dea034bf8677416f744f0f66ff4',1,'cv::cudev::atan(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad23653a760d85e4d8bbfa5745b87d46a',1,'cv::cudev::atan(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0517db8af089b0e0944a19ecf4dd8f9b',1,'cv::cudev::atan(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3501efbd5341dd76dfc3633e10c28ee',1,'cv::cudev::atan(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1e91e4112660c333cfa90c58360478',1,'cv::cudev::atan(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51ea14361d01f1cca9588d87b9c487d5',1,'cv::cudev::atan(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9729dd146f91a4831ae5971c04d2f328',1,'cv::cudev::atan(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59a7fb808c81f36c252aaf0fc670dd8d',1,'cv::cudev::atan(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46222230f712764b0453592e00047cb3',1,'cv::cudev::atan(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2aa924c2d92a1be4a0ab61bda786581',1,'cv::cudev::atan(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9a1c3324e3d1a3a3cec0bd83a9e6a86',1,'cv::cudev::atan(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3607a419266b05a79ab00353e65318e',1,'cv::cudev::atan(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1bb215c5a0b941c71a6d1cc86aac551',1,'cv::cudev::atan(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8aa2780e4680f5b6358b01d29295895a',1,'cv::cudev::atan(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d997e44717ac71efa7a9b7e77e7d2df',1,'cv::cudev::atan(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e8f4f3559282fe3b89bdc96ba0692e5',1,'cv::cudev::atan(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga811d7f5c5a8f51ed2d349a4fa5a89cd2',1,'cv::cudev::atan(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b4df626e0a9d9300ef730c13efbea26',1,'cv::cudev::atan(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98d2b1c113e5bbb8f87a28c4af40eac',1,'cv::cudev::atan(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76519038c10b0850b3cde04510e47628',1,'atan(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab95a1eb1e568567f99a4a80c017543b',1,'atan(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ff6e6613aa330d6879859b60fa249a9',1,'atan(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3c05d20d386b1322b5113843962724d',1,'atan(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6c4640461ed5be47b854d04c06a8e63',1,'atan(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab727395d294da3a0dfb9bf9451f6b2ae',1,'atan(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d35ea6aca3e67a1662eba95eda3fa8b',1,'atan(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41ae7f410575919bd4ce075352044af7',1,'atan(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40321639c1c78a1660232f1430ac5566',1,'atan(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b5d932a4a1bb008ae867523a1bd74a7',1,'atan(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76211c2027a8aa7e4155c3210425c95b',1,'atan(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fc1bb772d4564dac7cd7cb0ed7df80b',1,'atan(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d0c7779cc0f9a79c8073e1437d2e8e',1,'atan(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab00d9dea034bf8677416f744f0f66ff4',1,'atan(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad23653a760d85e4d8bbfa5745b87d46a',1,'atan(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0517db8af089b0e0944a19ecf4dd8f9b',1,'atan(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3501efbd5341dd76dfc3633e10c28ee',1,'atan(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1e91e4112660c333cfa90c58360478',1,'atan(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51ea14361d01f1cca9588d87b9c487d5',1,'atan(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9729dd146f91a4831ae5971c04d2f328',1,'atan(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59a7fb808c81f36c252aaf0fc670dd8d',1,'atan(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46222230f712764b0453592e00047cb3',1,'atan(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2aa924c2d92a1be4a0ab61bda786581',1,'atan(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9a1c3324e3d1a3a3cec0bd83a9e6a86',1,'atan(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3607a419266b05a79ab00353e65318e',1,'atan(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1bb215c5a0b941c71a6d1cc86aac551',1,'atan(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8aa2780e4680f5b6358b01d29295895a',1,'atan(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d997e44717ac71efa7a9b7e77e7d2df',1,'atan(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e8f4f3559282fe3b89bdc96ba0692e5',1,'atan(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga811d7f5c5a8f51ed2d349a4fa5a89cd2',1,'atan(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b4df626e0a9d9300ef730c13efbea26',1,'atan(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98d2b1c113e5bbb8f87a28c4af40eac',1,'atan(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a217a638ff609e744f9e5f5cf2837ec7c',1,'std::atan()'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a230744e17147d12e8ef3f2fc3796f64f',1,'Eigen::atan()']]], - ['atan_20calculation_707',['Atan calculation',['https://docs.opencv.org/4.2.0/d5/df4/group__core__hal__interface__fastAtan.html',1,'']]], - ['atan2_708',['atan2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1096ba687de70142e095cc791a8bcd65',1,'cv::cudev::atan2(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea17b004f2795d20b4a18042e99cbe07',1,'cv::cudev::atan2(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38a8c0dee5b828bd4bf6b8e7b46aa41d',1,'cv::cudev::atan2(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5a591894baa3eaf268fca9517b5119a',1,'cv::cudev::atan2(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46bfc86035dacd64b560e99228c07659',1,'cv::cudev::atan2(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf1a00440a0655c709cbd058716dd807',1,'cv::cudev::atan2(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49249a904bcbd03315115523af2396dd',1,'cv::cudev::atan2(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab861201447e7162e4a3783b5f51f2693',1,'cv::cudev::atan2(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9d3f511bf50dbd49eec6850dae931d6',1,'cv::cudev::atan2(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffd1e00289cb8d7c385a46a9399980c8',1,'cv::cudev::atan2(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab8bb7aba60c1d1b27978224cdb9df46',1,'cv::cudev::atan2(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e25e169d4b48f3684ac6033aab4467',1,'cv::cudev::atan2(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c12d43e2d8844a8bd757a0657a957b0',1,'cv::cudev::atan2(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed6f62d280746b5f504baa73ca8ed94',1,'cv::cudev::atan2(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157278f9faa761d2e34742ac26feeba4',1,'cv::cudev::atan2(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a77cd66704f8b0304cf769265e92fd5',1,'cv::cudev::atan2(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga745ff9d16168da5a7e298a2884a2aa83',1,'cv::cudev::atan2(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedc94b60c53bdd7dc5787a4e3d2e3a67',1,'cv::cudev::atan2(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44afd9cc0895caad98d1f98a77312de5',1,'cv::cudev::atan2(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f04f13e6001cac0be9cfeb61eeede4',1,'cv::cudev::atan2(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72659c64e6cd237e021a4957a4cee1b3',1,'cv::cudev::atan2(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3852f8a17d8f6fa5e508bc28acbf0ce',1,'cv::cudev::atan2(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e025ebc2f035ad65889d5652de96418',1,'cv::cudev::atan2(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa05dc5c9ddafb2bf3fe520bfe6437192',1,'cv::cudev::atan2(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e2d5e75d8a97349bfb41580e96b85dd',1,'cv::cudev::atan2(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d446715ec6432710cd53df3a27b2316',1,'cv::cudev::atan2(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85af58eb64bf1ae4cefd537619ec19bc',1,'cv::cudev::atan2(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93b3ad15464f549ebdd36ddc81c9bbde',1,'cv::cudev::atan2(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1719afb3423f877a90420e612b2a396',1,'cv::cudev::atan2(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b5ed200d1c1e7501c8a57b28c397d8b',1,'cv::cudev::atan2(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2af08219909de2e495e5dc3cd4a4837',1,'cv::cudev::atan2(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8d59c83e777636c7925105df14c43aa',1,'cv::cudev::atan2(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14ae533174c29f63b05b28a464dcdb0d',1,'cv::cudev::atan2(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60ed8ac4c9488179d768ede2ae159aff',1,'cv::cudev::atan2(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade8d766f68176ee3c197ba84b6add309',1,'cv::cudev::atan2(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc569183987aebd097dca26c293acf42',1,'cv::cudev::atan2(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d15bc12afaa97b73bc36f090c3058a4',1,'cv::cudev::atan2(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10e80a60e87509d67a16119a1a2ef215',1,'cv::cudev::atan2(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bdac88fad1b9935c35846d11f45b2f0',1,'cv::cudev::atan2(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga428417d9a9544f7256cef41b45ee85e0',1,'cv::cudev::atan2(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad4b704a40a60ce10160a4943041e2bb2',1,'cv::cudev::atan2(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd889240f8061747157ad751f8e8f01c',1,'cv::cudev::atan2(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga898aac014a0621131a0165b676755c7e',1,'cv::cudev::atan2(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0f5b4cb305a5cb141a374196a20f2b1',1,'cv::cudev::atan2(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada1efc2397252353284a743b9c070b4a',1,'cv::cudev::atan2(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d555044c48f10358a37362162d8af74',1,'cv::cudev::atan2(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36e4bb9f83dff6d168bcf6209f6dcf09',1,'cv::cudev::atan2(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa46979c44658d86f3357c21cba39b19f',1,'cv::cudev::atan2(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ef505d94d762872016cca9ec9f038a4',1,'cv::cudev::atan2(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad66b780d981442b462a3a18433e72d89',1,'cv::cudev::atan2(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9875261d377a22cb1cd8dd54df1b0c69',1,'cv::cudev::atan2(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31f93a8102d8a87db718bee8d3a61f3b',1,'cv::cudev::atan2(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ec7ffd33f29602103880fe8c01a9be5',1,'cv::cudev::atan2(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0111ffb3ef709cb3104909e489f95612',1,'cv::cudev::atan2(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga038366eaf3ea6431b8e6b5aee81e3b55',1,'cv::cudev::atan2(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga361e3513fe073e25fb1b30f30fff6343',1,'cv::cudev::atan2(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac30587655a3518b8080f4ac8f8f1a476',1,'cv::cudev::atan2(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga743bf1f058844e2f530be6b7640df1ab',1,'cv::cudev::atan2(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8080066cfee1055c098b44aca247c618',1,'cv::cudev::atan2(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6e266434cdcdc755bcfd6011beaf20f',1,'cv::cudev::atan2(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72461ef3d9a8d2e9757d08322c6961eb',1,'cv::cudev::atan2(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8828e7d633aab4c05f76f06216eb87c',1,'cv::cudev::atan2(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3123f7d63f0af6eb48dc102bf3ea4075',1,'cv::cudev::atan2(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ca7447aaf315124dd45d48c174d7c40',1,'cv::cudev::atan2(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b4bc4eb319b732a2baecc61d63f13d4',1,'cv::cudev::atan2(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f756ad7d2032f03f630a54d90825c0b',1,'cv::cudev::atan2(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae911b89ee2c2ce3fdad14200fa2a9392',1,'cv::cudev::atan2(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5504995a857dfa9231c8977ff2937dbe',1,'cv::cudev::atan2(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1adb312f5eefae17c11e654af632f6f7',1,'cv::cudev::atan2(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf128364ff1eb079a996bf6c4c8088917',1,'cv::cudev::atan2(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac01aecde5aac39ecbf6d8949f617fa81',1,'cv::cudev::atan2(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b942442fe1810dec67f4462dc5378e2',1,'cv::cudev::atan2(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16f74e9b699a44244e2de3c8ce7789ae',1,'cv::cudev::atan2(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56ef7a3cbbc7c66a48cf2de3e1bfc663',1,'cv::cudev::atan2(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4986df7c60cf5447e5eef4119227ccec',1,'cv::cudev::atan2(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafae1146f0520c4f1fc651d375ae9096e',1,'cv::cudev::atan2(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93233ff0b98013933ac07b4f5bb681c0',1,'cv::cudev::atan2(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76c799b57e64800230dd2060166a0d79',1,'cv::cudev::atan2(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b5f58036e964305abed793e9a1a0ab1',1,'cv::cudev::atan2(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcc428567f7868d81d7bed41a0d0db8a',1,'cv::cudev::atan2(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d4f255a1c9af270f5693e635c21b18e',1,'cv::cudev::atan2(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b0cb3a9ee9d6677dac546bf8b843251',1,'cv::cudev::atan2(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga885d50ba15deab10fab2beee8b480284',1,'cv::cudev::atan2(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f0c49f8a139ff8fc488b0b55ffedd81',1,'cv::cudev::atan2(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga381b37fe99c30d394ff60e8cdafceabc',1,'cv::cudev::atan2(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b50464bf014bfda723275f36f555424',1,'cv::cudev::atan2(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a1bcf68ac7d55c10e66bb68dc349557',1,'cv::cudev::atan2(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45fc71867baf50b3d75d57f437f89855',1,'cv::cudev::atan2(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga149b1802d88b8d90fa096da5b22034d8',1,'cv::cudev::atan2(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c327bb8321737f387da3ebf8da4f8e',1,'cv::cudev::atan2(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42256de3419110d8f1dd6c2d41bfe95',1,'cv::cudev::atan2(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga632ccaeae520dd63d5dcdd24c4b11143',1,'cv::cudev::atan2(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64a947ee9a3203c8f4c6bcbe99aedd16',1,'cv::cudev::atan2(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafea32ad9f9d1956b3b4724f4a4e76f97',1,'cv::cudev::atan2(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83a6f6d9ef686f9da3e473c8b94942fb',1,'cv::cudev::atan2(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3229276a7717fd211701120aaea64686',1,'cv::cudev::atan2(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7a1b4d7dbe10e19e19b2132f481d32a',1,'cv::cudev::atan2(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f72dd25ac836e50fd5b8e29b0a9e571',1,'cv::cudev::atan2(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga999171de7b45ae8d8a853f91e21cd395',1,'cv::cudev::atan2(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad4d2b2d41cdead9aabb34c273e1790dd',1,'cv::cudev::atan2(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59092bcc2cd2b683aa084b2bf86d8b8a',1,'cv::cudev::atan2(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49886e9c8f41624cb677886161a09e7a',1,'cv::cudev::atan2(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade1229e1aaa5a65a27162d10459cbd58',1,'cv::cudev::atan2(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e1a275293d52e75b6af41e3ed881194',1,'cv::cudev::atan2(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90abcedc1ca539ab2568c0e619426554',1,'cv::cudev::atan2(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecf3ce6295f95abdedf4a6177436c7a6',1,'cv::cudev::atan2(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8add44a50a911f32acba7f92e26a6cbd',1,'cv::cudev::atan2(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga002ad28c53028348b2b305aa65cf9d50',1,'cv::cudev::atan2(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3f9eff403a87a4808e58a55cefc0190',1,'cv::cudev::atan2(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b941c726171e23bf62c9977f097be50',1,'cv::cudev::atan2(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e536463d5526cd0759a5c885390d92e',1,'cv::cudev::atan2(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17cbb896cbfb8ea94b1409c2b37d9841',1,'cv::cudev::atan2(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15c31be946b78e4f80c491e9a17ff355',1,'cv::cudev::atan2(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aacbc5481ecfd9ad46722f2c7446ef4',1,'cv::cudev::atan2(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f1b98c16d106dfe3c3a304a7fb210fa',1,'cv::cudev::atan2(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d6e6c568b94218d8210bf11fe53c1e5',1,'cv::cudev::atan2(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5321c1e5ac530fda3a9475f67e0b3c98',1,'cv::cudev::atan2(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d5de286c458b9d0632bd71db7fa1783',1,'cv::cudev::atan2(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10f535124b8eadaf5dd0eb0c1cc619e0',1,'cv::cudev::atan2(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga994eac52fbaf9297dc990e027b61e44e',1,'cv::cudev::atan2(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41147256ef9f2894db35a83d18b3a822',1,'cv::cudev::atan2(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f3c1d10be53413916d71ff534e1ca8',1,'cv::cudev::atan2(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa83474d84ca53984187bdb2f85105e49',1,'cv::cudev::atan2(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga944b337b1290763bc823038188accab5',1,'cv::cudev::atan2(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9841bb4972928899b85bd903b9464b67',1,'cv::cudev::atan2(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b17d79dfac624311a9b19fa71fb9d32',1,'cv::cudev::atan2(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a835bb2b2cd1a2c47220d30c25c82c',1,'cv::cudev::atan2(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22374d1d47455e5ce8b45ef643c96786',1,'cv::cudev::atan2(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6fa1b5df2963cb0a8af7e0ee7cd87da',1,'cv::cudev::atan2(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea4a92f90ab1d184e271bcaa990ea260',1,'cv::cudev::atan2(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11770948c91fb9ae23e4d725b1485cc9',1,'cv::cudev::atan2(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa047916438b9b7c2b4cdbee8b62f1a7',1,'cv::cudev::atan2(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3630688c8119479632fbd4e541704ce2',1,'cv::cudev::atan2(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fece86f51df2f39ad090f8c863cbf75',1,'cv::cudev::atan2(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91a027876b30256165fc260eeef0ab5a',1,'cv::cudev::atan2(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa606210bf9ec7f9c8d43479345a56218',1,'cv::cudev::atan2(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga578ce83bb6c23773c6a7f3fe2098e40e',1,'cv::cudev::atan2(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d4546c30571db43534c080307ecd69d',1,'cv::cudev::atan2(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf23c3d564a07e98d30fbd0dcc2c564d',1,'cv::cudev::atan2(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9b655db78fcadb8131efc748e313044',1,'cv::cudev::atan2(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga646720fd65e8a68f28a85b236d4488d8',1,'cv::cudev::atan2(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe53a1f07b61f41c5f05c260ebb5d802',1,'cv::cudev::atan2(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac622474b43607e3f8cb0d8b501da2d45',1,'cv::cudev::atan2(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34afbf365de9a2cc23c22c349c0ffc99',1,'cv::cudev::atan2(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga945b9594aa8568ed90f930a246b8546c',1,'cv::cudev::atan2(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga479500e51eacd0650c2b7fd3134dfe6f',1,'cv::cudev::atan2(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga911eecb5f18a765751dbbf2e3b749505',1,'cv::cudev::atan2(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga551fdabe03747f18117c610707984c53',1,'cv::cudev::atan2(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedb4907088a6e72095a82667ec0dae3d',1,'cv::cudev::atan2(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e9557a4ab8f934e83942b629ffdba51',1,'cv::cudev::atan2(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55aae8c51913a949a9a5926e63f44776',1,'cv::cudev::atan2(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga634f63841368060113764d5d3fd4f5fd',1,'cv::cudev::atan2(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1096ba687de70142e095cc791a8bcd65',1,'atan2(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea17b004f2795d20b4a18042e99cbe07',1,'atan2(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38a8c0dee5b828bd4bf6b8e7b46aa41d',1,'atan2(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5a591894baa3eaf268fca9517b5119a',1,'atan2(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46bfc86035dacd64b560e99228c07659',1,'atan2(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf1a00440a0655c709cbd058716dd807',1,'atan2(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49249a904bcbd03315115523af2396dd',1,'atan2(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab861201447e7162e4a3783b5f51f2693',1,'atan2(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9d3f511bf50dbd49eec6850dae931d6',1,'atan2(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffd1e00289cb8d7c385a46a9399980c8',1,'atan2(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab8bb7aba60c1d1b27978224cdb9df46',1,'atan2(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e25e169d4b48f3684ac6033aab4467',1,'atan2(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c12d43e2d8844a8bd757a0657a957b0',1,'atan2(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed6f62d280746b5f504baa73ca8ed94',1,'atan2(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157278f9faa761d2e34742ac26feeba4',1,'atan2(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a77cd66704f8b0304cf769265e92fd5',1,'atan2(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga745ff9d16168da5a7e298a2884a2aa83',1,'atan2(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedc94b60c53bdd7dc5787a4e3d2e3a67',1,'atan2(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44afd9cc0895caad98d1f98a77312de5',1,'atan2(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f04f13e6001cac0be9cfeb61eeede4',1,'atan2(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72659c64e6cd237e021a4957a4cee1b3',1,'atan2(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3852f8a17d8f6fa5e508bc28acbf0ce',1,'atan2(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e025ebc2f035ad65889d5652de96418',1,'atan2(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa05dc5c9ddafb2bf3fe520bfe6437192',1,'atan2(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e2d5e75d8a97349bfb41580e96b85dd',1,'atan2(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d446715ec6432710cd53df3a27b2316',1,'atan2(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85af58eb64bf1ae4cefd537619ec19bc',1,'atan2(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93b3ad15464f549ebdd36ddc81c9bbde',1,'atan2(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1719afb3423f877a90420e612b2a396',1,'atan2(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b5ed200d1c1e7501c8a57b28c397d8b',1,'atan2(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2af08219909de2e495e5dc3cd4a4837',1,'atan2(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8d59c83e777636c7925105df14c43aa',1,'atan2(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14ae533174c29f63b05b28a464dcdb0d',1,'atan2(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60ed8ac4c9488179d768ede2ae159aff',1,'atan2(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade8d766f68176ee3c197ba84b6add309',1,'atan2(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc569183987aebd097dca26c293acf42',1,'atan2(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d15bc12afaa97b73bc36f090c3058a4',1,'atan2(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10e80a60e87509d67a16119a1a2ef215',1,'atan2(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bdac88fad1b9935c35846d11f45b2f0',1,'atan2(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga428417d9a9544f7256cef41b45ee85e0',1,'atan2(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad4b704a40a60ce10160a4943041e2bb2',1,'atan2(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd889240f8061747157ad751f8e8f01c',1,'atan2(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga898aac014a0621131a0165b676755c7e',1,'atan2(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0f5b4cb305a5cb141a374196a20f2b1',1,'atan2(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada1efc2397252353284a743b9c070b4a',1,'atan2(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d555044c48f10358a37362162d8af74',1,'atan2(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36e4bb9f83dff6d168bcf6209f6dcf09',1,'atan2(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa46979c44658d86f3357c21cba39b19f',1,'atan2(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ef505d94d762872016cca9ec9f038a4',1,'atan2(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad66b780d981442b462a3a18433e72d89',1,'atan2(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9875261d377a22cb1cd8dd54df1b0c69',1,'atan2(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31f93a8102d8a87db718bee8d3a61f3b',1,'atan2(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ec7ffd33f29602103880fe8c01a9be5',1,'atan2(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0111ffb3ef709cb3104909e489f95612',1,'atan2(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga038366eaf3ea6431b8e6b5aee81e3b55',1,'atan2(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga361e3513fe073e25fb1b30f30fff6343',1,'atan2(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac30587655a3518b8080f4ac8f8f1a476',1,'atan2(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga743bf1f058844e2f530be6b7640df1ab',1,'atan2(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8080066cfee1055c098b44aca247c618',1,'atan2(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6e266434cdcdc755bcfd6011beaf20f',1,'atan2(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72461ef3d9a8d2e9757d08322c6961eb',1,'atan2(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8828e7d633aab4c05f76f06216eb87c',1,'atan2(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3123f7d63f0af6eb48dc102bf3ea4075',1,'atan2(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ca7447aaf315124dd45d48c174d7c40',1,'atan2(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b4bc4eb319b732a2baecc61d63f13d4',1,'atan2(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f756ad7d2032f03f630a54d90825c0b',1,'atan2(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae911b89ee2c2ce3fdad14200fa2a9392',1,'atan2(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5504995a857dfa9231c8977ff2937dbe',1,'atan2(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1adb312f5eefae17c11e654af632f6f7',1,'atan2(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf128364ff1eb079a996bf6c4c8088917',1,'atan2(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac01aecde5aac39ecbf6d8949f617fa81',1,'atan2(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b942442fe1810dec67f4462dc5378e2',1,'atan2(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16f74e9b699a44244e2de3c8ce7789ae',1,'atan2(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56ef7a3cbbc7c66a48cf2de3e1bfc663',1,'atan2(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4986df7c60cf5447e5eef4119227ccec',1,'atan2(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafae1146f0520c4f1fc651d375ae9096e',1,'atan2(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93233ff0b98013933ac07b4f5bb681c0',1,'atan2(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76c799b57e64800230dd2060166a0d79',1,'atan2(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b5f58036e964305abed793e9a1a0ab1',1,'atan2(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcc428567f7868d81d7bed41a0d0db8a',1,'atan2(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d4f255a1c9af270f5693e635c21b18e',1,'atan2(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b0cb3a9ee9d6677dac546bf8b843251',1,'atan2(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga885d50ba15deab10fab2beee8b480284',1,'atan2(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f0c49f8a139ff8fc488b0b55ffedd81',1,'atan2(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga381b37fe99c30d394ff60e8cdafceabc',1,'atan2(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b50464bf014bfda723275f36f555424',1,'atan2(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a1bcf68ac7d55c10e66bb68dc349557',1,'atan2(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45fc71867baf50b3d75d57f437f89855',1,'atan2(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga149b1802d88b8d90fa096da5b22034d8',1,'atan2(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c327bb8321737f387da3ebf8da4f8e',1,'atan2(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42256de3419110d8f1dd6c2d41bfe95',1,'atan2(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga632ccaeae520dd63d5dcdd24c4b11143',1,'atan2(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64a947ee9a3203c8f4c6bcbe99aedd16',1,'atan2(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafea32ad9f9d1956b3b4724f4a4e76f97',1,'atan2(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83a6f6d9ef686f9da3e473c8b94942fb',1,'atan2(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3229276a7717fd211701120aaea64686',1,'atan2(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7a1b4d7dbe10e19e19b2132f481d32a',1,'atan2(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f72dd25ac836e50fd5b8e29b0a9e571',1,'atan2(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga999171de7b45ae8d8a853f91e21cd395',1,'atan2(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad4d2b2d41cdead9aabb34c273e1790dd',1,'atan2(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59092bcc2cd2b683aa084b2bf86d8b8a',1,'atan2(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49886e9c8f41624cb677886161a09e7a',1,'atan2(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade1229e1aaa5a65a27162d10459cbd58',1,'atan2(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e1a275293d52e75b6af41e3ed881194',1,'atan2(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90abcedc1ca539ab2568c0e619426554',1,'atan2(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecf3ce6295f95abdedf4a6177436c7a6',1,'atan2(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8add44a50a911f32acba7f92e26a6cbd',1,'atan2(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga002ad28c53028348b2b305aa65cf9d50',1,'atan2(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3f9eff403a87a4808e58a55cefc0190',1,'atan2(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b941c726171e23bf62c9977f097be50',1,'atan2(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e536463d5526cd0759a5c885390d92e',1,'atan2(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17cbb896cbfb8ea94b1409c2b37d9841',1,'atan2(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15c31be946b78e4f80c491e9a17ff355',1,'atan2(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aacbc5481ecfd9ad46722f2c7446ef4',1,'atan2(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f1b98c16d106dfe3c3a304a7fb210fa',1,'atan2(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d6e6c568b94218d8210bf11fe53c1e5',1,'atan2(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5321c1e5ac530fda3a9475f67e0b3c98',1,'atan2(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d5de286c458b9d0632bd71db7fa1783',1,'atan2(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10f535124b8eadaf5dd0eb0c1cc619e0',1,'atan2(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga994eac52fbaf9297dc990e027b61e44e',1,'atan2(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41147256ef9f2894db35a83d18b3a822',1,'atan2(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f3c1d10be53413916d71ff534e1ca8',1,'atan2(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa83474d84ca53984187bdb2f85105e49',1,'atan2(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga944b337b1290763bc823038188accab5',1,'atan2(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9841bb4972928899b85bd903b9464b67',1,'atan2(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b17d79dfac624311a9b19fa71fb9d32',1,'atan2(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a835bb2b2cd1a2c47220d30c25c82c',1,'atan2(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22374d1d47455e5ce8b45ef643c96786',1,'atan2(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6fa1b5df2963cb0a8af7e0ee7cd87da',1,'atan2(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea4a92f90ab1d184e271bcaa990ea260',1,'atan2(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11770948c91fb9ae23e4d725b1485cc9',1,'atan2(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa047916438b9b7c2b4cdbee8b62f1a7',1,'atan2(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3630688c8119479632fbd4e541704ce2',1,'atan2(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fece86f51df2f39ad090f8c863cbf75',1,'atan2(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91a027876b30256165fc260eeef0ab5a',1,'atan2(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa606210bf9ec7f9c8d43479345a56218',1,'atan2(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga578ce83bb6c23773c6a7f3fe2098e40e',1,'atan2(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d4546c30571db43534c080307ecd69d',1,'atan2(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf23c3d564a07e98d30fbd0dcc2c564d',1,'atan2(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9b655db78fcadb8131efc748e313044',1,'atan2(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga646720fd65e8a68f28a85b236d4488d8',1,'atan2(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe53a1f07b61f41c5f05c260ebb5d802',1,'atan2(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac622474b43607e3f8cb0d8b501da2d45',1,'atan2(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34afbf365de9a2cc23c22c349c0ffc99',1,'atan2(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga945b9594aa8568ed90f930a246b8546c',1,'atan2(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga479500e51eacd0650c2b7fd3134dfe6f',1,'atan2(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga911eecb5f18a765751dbbf2e3b749505',1,'atan2(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga551fdabe03747f18117c610707984c53',1,'atan2(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedb4907088a6e72095a82667ec0dae3d',1,'atan2(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e9557a4ab8f934e83942b629ffdba51',1,'atan2(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55aae8c51913a949a9a5926e63f44776',1,'atan2(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga634f63841368060113764d5d3fd4f5fd',1,'atan2(double s, const double4 &b)(Global Namespace)']]], - ['atan2_5f_709',['atan2_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49ad9adb23b8dcb67962c5360937851b',1,'cv::cudev::atan2_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49ad9adb23b8dcb67962c5360937851b',1,'atan2_()(Global Namespace)']]], - ['atan2_5ffunc_710',['atan2_func',['https://docs.opencv.org/4.2.0/d4/d8e/structcv_1_1cudev_1_1atan2__func.html',1,'cv::cudev']]], - ['atan2_5ffunc_3c_20double_20_3e_711',['atan2_func< double >',['https://docs.opencv.org/4.2.0/d8/d15/structcv_1_1cudev_1_1atan2__func_3_01double_01_4.html',1,'cv::cudev']]], - ['atan2_5ffunc_3c_20float_20_3e_712',['atan2_func< float >',['https://docs.opencv.org/4.2.0/d0/df1/structcv_1_1cudev_1_1atan2__func_3_01float_01_4.html',1,'cv::cudev']]], - ['atan2_5ffunc_3c_20schar_20_3e_713',['atan2_func< schar >',['https://docs.opencv.org/4.2.0/da/da9/structcv_1_1cudev_1_1atan2__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['atan2_5ffunc_3c_20short_20_3e_714',['atan2_func< short >',['https://docs.opencv.org/4.2.0/d9/dc9/structcv_1_1cudev_1_1atan2__func_3_01short_01_4.html',1,'cv::cudev']]], - ['atan2_5ffunc_3c_20uchar_20_3e_715',['atan2_func< uchar >',['https://docs.opencv.org/4.2.0/d3/d1d/structcv_1_1cudev_1_1atan2__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['atan2_5ffunc_3c_20uint_20_3e_716',['atan2_func< uint >',['https://docs.opencv.org/4.2.0/d1/d4a/structcv_1_1cudev_1_1atan2__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['atan2_5ffunc_3c_20ushort_20_3e_717',['atan2_func< ushort >',['https://docs.opencv.org/4.2.0/d3/d2f/structcv_1_1cudev_1_1atan2__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['atan_5f_718',['atan_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a9b23d645cd6a6fccaef17d81ce5ddf',1,'cv::cudev::atan_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a9b23d645cd6a6fccaef17d81ce5ddf',1,'atan_()(Global Namespace)']]], - ['atan_5ffunc_719',['atan_func',['https://docs.opencv.org/4.2.0/df/d91/structcv_1_1cudev_1_1atan__func.html',1,'cv::cudev']]], - ['atan_5ffunc_3c_20double_20_3e_720',['atan_func< double >',['https://docs.opencv.org/4.2.0/d4/d8e/structcv_1_1cudev_1_1atan__func_3_01double_01_4.html',1,'cv::cudev']]], - ['atan_5ffunc_3c_20float_20_3e_721',['atan_func< float >',['https://docs.opencv.org/4.2.0/d8/dc1/structcv_1_1cudev_1_1atan__func_3_01float_01_4.html',1,'cv::cudev']]], - ['atan_5ffunc_3c_20schar_20_3e_722',['atan_func< schar >',['https://docs.opencv.org/4.2.0/dd/d4a/structcv_1_1cudev_1_1atan__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['atan_5ffunc_3c_20short_20_3e_723',['atan_func< short >',['https://docs.opencv.org/4.2.0/d5/d20/structcv_1_1cudev_1_1atan__func_3_01short_01_4.html',1,'cv::cudev']]], - ['atan_5ffunc_3c_20uchar_20_3e_724',['atan_func< uchar >',['https://docs.opencv.org/4.2.0/dd/dce/structcv_1_1cudev_1_1atan__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['atan_5ffunc_3c_20uint_20_3e_725',['atan_func< uint >',['https://docs.opencv.org/4.2.0/d2/de6/structcv_1_1cudev_1_1atan__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['atan_5ffunc_3c_20ushort_20_3e_726',['atan_func< ushort >',['https://docs.opencv.org/4.2.0/d1/da0/structcv_1_1cudev_1_1atan__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['atanh_727',['atanh',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab87d29c00e6d75aeab43eff53bf5164c',1,'Eigen::MatrixBase::atanh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab87d29c00e6d75aeab43eff53bf5164c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::atanh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab87d29c00e6d75aeab43eff53bf5164c',1,'MatrixBase< Solve< Decomposition, RhsType > >::atanh()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7382bae640576ef972071950549b7844',1,'cv::cudev::atanh(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95356e3cd239ada11d924e9562cb3c64',1,'cv::cudev::atanh(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0117221d7840a2198927613398e20fb',1,'cv::cudev::atanh(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae64d84317c18b4cd7eb3962e030b0dd8',1,'cv::cudev::atanh(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab75aea5aa3f31272df86334ade578d78',1,'cv::cudev::atanh(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga546711360eb44f8b7120f2870f091d43',1,'cv::cudev::atanh(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4fa52f4bdf78dc1836ce04ec11173f2',1,'cv::cudev::atanh(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafccd9fe9b2011c871ced6f50fbeccdd',1,'cv::cudev::atanh(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc6c9052fbc49be729795ec31d9e0e1d',1,'cv::cudev::atanh(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadab3c3980412a93904c34de1c8ef5c34',1,'cv::cudev::atanh(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga159a0c3eb6143ae0dddcd2f5473a71b3',1,'cv::cudev::atanh(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7091bf46e1d23c5c861514300709851',1,'cv::cudev::atanh(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa18edb980d38f3601d79a348fa915e15',1,'cv::cudev::atanh(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e5147f5cf4e8e4e719adfeef1df755e',1,'cv::cudev::atanh(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5a277070a85d4a000613dfecb79c501',1,'cv::cudev::atanh(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4d50aa2b3224bd33dad1d3d04ad8a44',1,'cv::cudev::atanh(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cf30b9d65c02e122539508531c88d0d',1,'cv::cudev::atanh(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bdc3993d4fd0cf39012fb1e9bcfdc10',1,'cv::cudev::atanh(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeabb2086e7a0e46dbc340bf910527262',1,'cv::cudev::atanh(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga907bc6eb8c5861cfea9f27c966482d52',1,'cv::cudev::atanh(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7348a10e3b1d5efe4caf9dce3f6271a',1,'cv::cudev::atanh(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6ff46f8e3e5ff08cb10622a9e82f9dc',1,'cv::cudev::atanh(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf27c1925e07f578117d0b45471f796d',1,'cv::cudev::atanh(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5bc6dda3a104de7087fc7cade12695f4',1,'cv::cudev::atanh(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf243ab763fa932beffcc7b91ff25afd7',1,'cv::cudev::atanh(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef7a907aea347c40d17e76067e0d4c6a',1,'cv::cudev::atanh(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73bd058c5966fa3e812bdcd04c7eabcb',1,'cv::cudev::atanh(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43fd6b7419a33f29bc94ef35ceec0f51',1,'cv::cudev::atanh(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga826751d1ff7f93636dc46d85e2cc8f75',1,'cv::cudev::atanh(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac08b0b1627e3dbb613df67bda6cf1de1',1,'cv::cudev::atanh(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a8dc998f1edd38ba901f6ccc536dc14',1,'cv::cudev::atanh(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f54acfb1d41ea4260e841bb7dff3613',1,'cv::cudev::atanh(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7382bae640576ef972071950549b7844',1,'atanh(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95356e3cd239ada11d924e9562cb3c64',1,'atanh(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0117221d7840a2198927613398e20fb',1,'atanh(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae64d84317c18b4cd7eb3962e030b0dd8',1,'atanh(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab75aea5aa3f31272df86334ade578d78',1,'atanh(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga546711360eb44f8b7120f2870f091d43',1,'atanh(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4fa52f4bdf78dc1836ce04ec11173f2',1,'atanh(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafccd9fe9b2011c871ced6f50fbeccdd',1,'atanh(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc6c9052fbc49be729795ec31d9e0e1d',1,'atanh(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadab3c3980412a93904c34de1c8ef5c34',1,'atanh(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga159a0c3eb6143ae0dddcd2f5473a71b3',1,'atanh(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7091bf46e1d23c5c861514300709851',1,'atanh(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa18edb980d38f3601d79a348fa915e15',1,'atanh(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e5147f5cf4e8e4e719adfeef1df755e',1,'atanh(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5a277070a85d4a000613dfecb79c501',1,'atanh(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4d50aa2b3224bd33dad1d3d04ad8a44',1,'atanh(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cf30b9d65c02e122539508531c88d0d',1,'atanh(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bdc3993d4fd0cf39012fb1e9bcfdc10',1,'atanh(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeabb2086e7a0e46dbc340bf910527262',1,'atanh(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga907bc6eb8c5861cfea9f27c966482d52',1,'atanh(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7348a10e3b1d5efe4caf9dce3f6271a',1,'atanh(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6ff46f8e3e5ff08cb10622a9e82f9dc',1,'atanh(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf27c1925e07f578117d0b45471f796d',1,'atanh(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5bc6dda3a104de7087fc7cade12695f4',1,'atanh(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf243ab763fa932beffcc7b91ff25afd7',1,'atanh(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef7a907aea347c40d17e76067e0d4c6a',1,'atanh(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73bd058c5966fa3e812bdcd04c7eabcb',1,'atanh(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43fd6b7419a33f29bc94ef35ceec0f51',1,'atanh(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga826751d1ff7f93636dc46d85e2cc8f75',1,'atanh(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac08b0b1627e3dbb613df67bda6cf1de1',1,'atanh(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a8dc998f1edd38ba901f6ccc536dc14',1,'atanh(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f54acfb1d41ea4260e841bb7dff3613',1,'atanh(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abaa325495d208118ae2201fc82749a9e',1,'std::atanh()'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a45d37a9f1c784eb8ab61ed24f07f436f',1,'Eigen::atanh()']]], - ['atanh_5f_728',['atanh_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90fa68c268f5fc22387268dfa8628039',1,'cv::cudev::atanh_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90fa68c268f5fc22387268dfa8628039',1,'atanh_()(Global Namespace)']]], - ['atanh_5ffunc_729',['atanh_func',['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1cudev_1_1atanh__func.html',1,'cv::cudev']]], - ['atanh_5ffunc_3c_20double_20_3e_730',['atanh_func< double >',['https://docs.opencv.org/4.2.0/dd/d41/structcv_1_1cudev_1_1atanh__func_3_01double_01_4.html',1,'cv::cudev']]], - ['atanh_5ffunc_3c_20float_20_3e_731',['atanh_func< float >',['https://docs.opencv.org/4.2.0/dd/d2d/structcv_1_1cudev_1_1atanh__func_3_01float_01_4.html',1,'cv::cudev']]], - ['atanh_5ffunc_3c_20schar_20_3e_732',['atanh_func< schar >',['https://docs.opencv.org/4.2.0/d2/dd6/structcv_1_1cudev_1_1atanh__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['atanh_5ffunc_3c_20short_20_3e_733',['atanh_func< short >',['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1cudev_1_1atanh__func_3_01short_01_4.html',1,'cv::cudev']]], - ['atanh_5ffunc_3c_20uchar_20_3e_734',['atanh_func< uchar >',['https://docs.opencv.org/4.2.0/d7/d90/structcv_1_1cudev_1_1atanh__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['atanh_5ffunc_3c_20uint_20_3e_735',['atanh_func< uint >',['https://docs.opencv.org/4.2.0/d2/ddc/structcv_1_1cudev_1_1atanh__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['atanh_5ffunc_3c_20ushort_20_3e_736',['atanh_func< ushort >',['https://docs.opencv.org/4.2.0/d8/dd0/structcv_1_1cudev_1_1atanh__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['atdelete_737',['atdelete',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a7b1f9a5d6c7bfe011670757995c77f04',1,'cv::hdf::HDF5']]], - ['ate_738',['ate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'basic_ios< char, _Traits >::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'basic_iostream< char >::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'basic_istream< char >::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'basic_istream< char, _Traits >::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'basic_ostream< char >::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'basic_ostream< char, _Traits >::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_fstream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_ifstream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_ios::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_iostream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_istream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_istringstream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_ofstream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_ostream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_ostringstream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_stringstream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::ios_base::ate']]], - ['atexists_739',['atexists',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a3ce1d93d746a79d6eabaadeae783956e',1,'cv::hdf::HDF5']]], - ['atframesize_740',['atFrameSize',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a5d53b7574e0b2196962e8a2725ee5bf6',1,'cv::AVIWriteContainer']]], - ['atomic_741',['atomic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01727.html',1,'std::atomic< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00044.html',1,'(Global Namespace)']]], - ['atomic_2ehpp_742',['atomic.hpp',['https://docs.opencv.org/4.2.0/d5/d6c/atomic_8hpp.html',1,'']]], - ['atomic_3c_20_5ftp_20_2a_20_3e_743',['atomic< _Tp * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01735.html',1,'std']]], - ['atomic_3c_20bool_20_3e_744',['atomic< bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01731.html',1,'std']]], - ['atomic_3c_20char_20_3e_745',['atomic< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01739.html',1,'std']]], - ['atomic_3c_20char16_5ft_20_3e_746',['atomic< char16_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01787.html',1,'std']]], - ['atomic_3c_20char32_5ft_20_3e_747',['atomic< char32_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01791.html',1,'std']]], - ['atomic_3c_20int_20_3e_748',['atomic< int >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01759.html',1,'std']]], - ['atomic_3c_20long_20_3e_749',['atomic< long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01767.html',1,'std']]], - ['atomic_3c_20long_20long_20_3e_750',['atomic< long long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01775.html',1,'std']]], - ['atomic_3c_20short_20_3e_751',['atomic< short >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01751.html',1,'std']]], - ['atomic_3c_20signed_20char_20_3e_752',['atomic< signed char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01743.html',1,'std']]], - ['atomic_3c_20unsigned_20char_20_3e_753',['atomic< unsigned char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01747.html',1,'std']]], - ['atomic_3c_20unsigned_20int_20_3e_754',['atomic< unsigned int >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01763.html',1,'std']]], - ['atomic_3c_20unsigned_20long_20_3e_755',['atomic< unsigned long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01771.html',1,'std']]], - ['atomic_3c_20unsigned_20long_20long_20_3e_756',['atomic< unsigned long long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01779.html',1,'std']]], - ['atomic_3c_20unsigned_20short_20_3e_757',['atomic< unsigned short >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01755.html',1,'std']]], - ['atomic_3c_20wchar_5ft_20_3e_758',['atomic< wchar_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01783.html',1,'std']]], - ['atomic_5fbase_2eh_759',['atomic_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00275.html',1,'']]], - ['atomic_5fbool_760',['atomic_bool',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf6086d29df25216dda5a4a25283e8c1b',1,'std::atomic_bool'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf6086d29df25216dda5a4a25283e8c1b',1,'atomic_bool(Global Namespace)']]], - ['atomic_5fchar_761',['atomic_char',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8cc2dcae0c8faa76777765c4f1c0556e',1,'std::atomic_char'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8cc2dcae0c8faa76777765c4f1c0556e',1,'atomic_char(Global Namespace)']]], - ['atomic_5fchar16_5ft_762',['atomic_char16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gabf645b9de4785104feaa9827cd672279',1,'std::atomic_char16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gabf645b9de4785104feaa9827cd672279',1,'atomic_char16_t(Global Namespace)']]], - ['atomic_5fchar32_5ft_763',['atomic_char32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaceeeb98077f495bd03a4a8186b93c042',1,'std::atomic_char32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaceeeb98077f495bd03a4a8186b93c042',1,'atomic_char32_t(Global Namespace)']]], - ['atomic_5fcompare_5fexchange_5fstrong_764',['atomic_compare_exchange_strong',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8b4c27092fe0543d16aa24679ab64f35',1,'std::atomic_compare_exchange_strong(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga7f9e658275d4a2cdbf1b6a00d02adcc7',1,'std::atomic_compare_exchange_strong(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8b4c27092fe0543d16aa24679ab64f35',1,'atomic_compare_exchange_strong(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga7f9e658275d4a2cdbf1b6a00d02adcc7',1,'atomic_compare_exchange_strong(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w)(Global Namespace)']]], - ['atomic_5fcompare_5fexchange_5fstrong_5fexplicit_765',['atomic_compare_exchange_strong_explicit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga7b812df2cdd0c01f09d65168d22418c9',1,'std::atomic_compare_exchange_strong_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w, memory_order, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8ac0b3f7aae34919ebc25fc54ff6b9c8',1,'std::atomic_compare_exchange_strong_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w, memory_order, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga7b812df2cdd0c01f09d65168d22418c9',1,'atomic_compare_exchange_strong_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w, memory_order, memory_order)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8ac0b3f7aae34919ebc25fc54ff6b9c8',1,'atomic_compare_exchange_strong_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w, memory_order, memory_order)(Global Namespace)']]], - ['atomic_5fcompare_5fexchange_5fweak_766',['atomic_compare_exchange_weak',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga6aa9828191cf7749c72581e719dde0b0',1,'std::atomic_compare_exchange_weak(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga6860aafd01c4daf71cca0efe5193437f',1,'std::atomic_compare_exchange_weak(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga6aa9828191cf7749c72581e719dde0b0',1,'atomic_compare_exchange_weak(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga6860aafd01c4daf71cca0efe5193437f',1,'atomic_compare_exchange_weak(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w)(Global Namespace)']]], - ['atomic_5fcompare_5fexchange_5fweak_5fexplicit_767',['atomic_compare_exchange_weak_explicit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8ddc9b0002afbe0001718de9c8ca931e',1,'std::atomic_compare_exchange_weak_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w, memory_order __success, memory_order __failure)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga31df9efdf79235d0f8e112d245deb431',1,'std::atomic_compare_exchange_weak_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w, memory_order __success, memory_order __failure)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8ddc9b0002afbe0001718de9c8ca931e',1,'atomic_compare_exchange_weak_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w, memory_order __success, memory_order __failure)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga31df9efdf79235d0f8e112d245deb431',1,'atomic_compare_exchange_weak_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w, memory_order __success, memory_order __failure)(Global Namespace)']]], - ['atomic_5fexchange_768',['atomic_exchange',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga0e05e0e96f4b0cfdce2e7f6143976070',1,'std::atomic_exchange(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga419348e5a13dcd7fdccd244f6c15bd35',1,'std::atomic_exchange(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga0e05e0e96f4b0cfdce2e7f6143976070',1,'atomic_exchange(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga419348e5a13dcd7fdccd244f6c15bd35',1,'atomic_exchange(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r)(Global Namespace)']]], - ['atomic_5fexchange_5fexplicit_769',['atomic_exchange_explicit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga663e97cb5020aa674934c4eda56ea7a0',1,'std::atomic_exchange_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac73bf6a6160e468fc776581bcecd5424',1,'std::atomic_exchange_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga663e97cb5020aa674934c4eda56ea7a0',1,'atomic_exchange_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r, memory_order)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac73bf6a6160e468fc776581bcecd5424',1,'atomic_exchange_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r, memory_order)(Global Namespace)']]], - ['atomic_5fflag_770',['atomic_flag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04819.html',1,'std']]], - ['atomic_5ffutex_2eh_771',['atomic_futex.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00278.html',1,'']]], - ['atomic_5fint_772',['atomic_int',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8e9e8e31eec44834b1fa3ec4e1ccf3e7',1,'std::atomic_int'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8e9e8e31eec44834b1fa3ec4e1ccf3e7',1,'atomic_int(Global Namespace)']]], - ['atomic_5fint16_5ft_773',['atomic_int16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga499c4d63597f582f334f53fe66390130',1,'std::atomic_int16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga499c4d63597f582f334f53fe66390130',1,'atomic_int16_t(Global Namespace)']]], - ['atomic_5fint32_5ft_774',['atomic_int32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaabd065724c5ce31539dedb8add48ac46',1,'std::atomic_int32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaabd065724c5ce31539dedb8add48ac46',1,'atomic_int32_t(Global Namespace)']]], - ['atomic_5fint64_5ft_775',['atomic_int64_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga919f362eb712ce8408b2e7fc93986ce9',1,'std::atomic_int64_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga919f362eb712ce8408b2e7fc93986ce9',1,'atomic_int64_t(Global Namespace)']]], - ['atomic_5fint8_5ft_776',['atomic_int8_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gab650a220c21b0cc1f05c207466d10f2b',1,'std::atomic_int8_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gab650a220c21b0cc1f05c207466d10f2b',1,'atomic_int8_t(Global Namespace)']]], - ['atomic_5fint_5ffast16_5ft_777',['atomic_int_fast16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaa216f3a1d57fa3c13c4d59ab3c45b461',1,'std::atomic_int_fast16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaa216f3a1d57fa3c13c4d59ab3c45b461',1,'atomic_int_fast16_t(Global Namespace)']]], - ['atomic_5fint_5ffast32_5ft_778',['atomic_int_fast32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8c46317e4ac11eaa3e53f2ec66158fc0',1,'std::atomic_int_fast32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8c46317e4ac11eaa3e53f2ec66158fc0',1,'atomic_int_fast32_t(Global Namespace)']]], - ['atomic_5fint_5ffast64_5ft_779',['atomic_int_fast64_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gac2dff45ca4a14c2bb7f1ad3360377344',1,'std::atomic_int_fast64_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gac2dff45ca4a14c2bb7f1ad3360377344',1,'atomic_int_fast64_t(Global Namespace)']]], - ['atomic_5fint_5ffast8_5ft_780',['atomic_int_fast8_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaecfbb17217b6ff2f0c15e49dfd7ec459',1,'std::atomic_int_fast8_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaecfbb17217b6ff2f0c15e49dfd7ec459',1,'atomic_int_fast8_t(Global Namespace)']]], - ['atomic_5fint_5fleast16_5ft_781',['atomic_int_least16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gad6a704d09ccc631022ebc6733817362b',1,'std::atomic_int_least16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gad6a704d09ccc631022ebc6733817362b',1,'atomic_int_least16_t(Global Namespace)']]], - ['atomic_5fint_5fleast32_5ft_782',['atomic_int_least32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga72bfafa96eaec8a7d8a0e71f706dd40f',1,'std::atomic_int_least32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga72bfafa96eaec8a7d8a0e71f706dd40f',1,'atomic_int_least32_t(Global Namespace)']]], - ['atomic_5fint_5fleast64_5ft_783',['atomic_int_least64_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf3dcb968315142320d83651f335325ff',1,'std::atomic_int_least64_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf3dcb968315142320d83651f335325ff',1,'atomic_int_least64_t(Global Namespace)']]], - ['atomic_5fint_5fleast8_5ft_784',['atomic_int_least8_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga1b1448266ad00a16c95e1f8bbc98e659',1,'std::atomic_int_least8_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga1b1448266ad00a16c95e1f8bbc98e659',1,'atomic_int_least8_t(Global Namespace)']]], - ['atomic_5fintmax_5ft_785',['atomic_intmax_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga02ac5738a7a9f78bf894ace288d90576',1,'std::atomic_intmax_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga02ac5738a7a9f78bf894ace288d90576',1,'atomic_intmax_t(Global Namespace)']]], - ['atomic_5fintptr_5ft_786',['atomic_intptr_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga479fe44f81f5f2a68e9b10d022e4b563',1,'std::atomic_intptr_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga479fe44f81f5f2a68e9b10d022e4b563',1,'atomic_intptr_t(Global Namespace)']]], - ['atomic_5fis_5flock_5ffree_787',['atomic_is_lock_free',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga26f0b2f2e5e143c43b9ac86853cdb495',1,'std::atomic_is_lock_free(const __shared_ptr< _Tp, _Lp > *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga5fe925503fa03a8132ab6ac8c3d05017',1,'std::atomic_is_lock_free(const shared_ptr< _Tp > *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga26f0b2f2e5e143c43b9ac86853cdb495',1,'atomic_is_lock_free(const __shared_ptr< _Tp, _Lp > *__p)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga5fe925503fa03a8132ab6ac8c3d05017',1,'atomic_is_lock_free(const shared_ptr< _Tp > *__p)(Global Namespace)']]], - ['atomic_5fllong_788',['atomic_llong',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gabf25364f5fd505a27d78d7e3434ec337',1,'std::atomic_llong'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gabf25364f5fd505a27d78d7e3434ec337',1,'atomic_llong(Global Namespace)']]], - ['atomic_5fload_789',['atomic_load',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gaa1f2f437e65f14cbc39dc5aa9c7787cb',1,'std::atomic_load(const shared_ptr< _Tp > *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga068286dfd18be5a7656c478f4b23ea11',1,'std::atomic_load(const __shared_ptr< _Tp, _Lp > *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gaa1f2f437e65f14cbc39dc5aa9c7787cb',1,'atomic_load(const shared_ptr< _Tp > *__p)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga068286dfd18be5a7656c478f4b23ea11',1,'atomic_load(const __shared_ptr< _Tp, _Lp > *__p)(Global Namespace)']]], - ['atomic_5fload_5fexplicit_790',['atomic_load_explicit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac5834272ab3ee80d5263ec71c30d4e40',1,'std::atomic_load_explicit(const shared_ptr< _Tp > *__p, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac10fed73419a9afc7442fcf685c9f4ef',1,'std::atomic_load_explicit(const __shared_ptr< _Tp, _Lp > *__p, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac5834272ab3ee80d5263ec71c30d4e40',1,'atomic_load_explicit(const shared_ptr< _Tp > *__p, memory_order)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac10fed73419a9afc7442fcf685c9f4ef',1,'atomic_load_explicit(const __shared_ptr< _Tp, _Lp > *__p, memory_order)(Global Namespace)']]], - ['atomic_5flockfree_5fdefines_2eh_791',['atomic_lockfree_defines.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00281.html',1,'']]], - ['atomic_5flong_792',['atomic_long',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga516afb5820a1d4d2bee3016c335e7f32',1,'std::atomic_long'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga516afb5820a1d4d2bee3016c335e7f32',1,'atomic_long(Global Namespace)']]], - ['atomic_5fptrdiff_5ft_793',['atomic_ptrdiff_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gac91469c8dac9ea566aa123ee72834456',1,'std::atomic_ptrdiff_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gac91469c8dac9ea566aa123ee72834456',1,'atomic_ptrdiff_t(Global Namespace)']]], - ['atomic_5fschar_794',['atomic_schar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga149ab9f968045c030b28cc66b21c90fe',1,'std::atomic_schar'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga149ab9f968045c030b28cc66b21c90fe',1,'atomic_schar(Global Namespace)']]], - ['atomic_5fshort_795',['atomic_short',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga57ba7af47bbbe212c68aac803df94e66',1,'std::atomic_short'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga57ba7af47bbbe212c68aac803df94e66',1,'atomic_short(Global Namespace)']]], - ['atomic_5fsize_5ft_796',['atomic_size_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga50f0c06e2ed82868b43d9fdf802c15dd',1,'std::atomic_size_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga50f0c06e2ed82868b43d9fdf802c15dd',1,'atomic_size_t(Global Namespace)']]], - ['atomic_5fstore_797',['atomic_store',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gaad7c9077082544dc2454ef66eb252cad',1,'std::atomic_store(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gaf607a58027ea400e7688daa2832c67ef',1,'std::atomic_store(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gaad7c9077082544dc2454ef66eb252cad',1,'atomic_store(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gaf607a58027ea400e7688daa2832c67ef',1,'atomic_store(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r)(Global Namespace)']]], - ['atomic_5fstore_5fexplicit_798',['atomic_store_explicit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac459811f24dfa61ca04dff98c59b0433',1,'std::atomic_store_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga4fb42f2c743388ba4dcf24abf0cc2701',1,'std::atomic_store_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac459811f24dfa61ca04dff98c59b0433',1,'atomic_store_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r, memory_order)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga4fb42f2c743388ba4dcf24abf0cc2701',1,'atomic_store_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r, memory_order)(Global Namespace)']]], - ['atomic_5fuchar_799',['atomic_uchar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gae195150d772d7de1590a467c94d2efbd',1,'std::atomic_uchar'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gae195150d772d7de1590a467c94d2efbd',1,'atomic_uchar(Global Namespace)']]], - ['atomic_5fuint_800',['atomic_uint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8229f523dabc2103dd045fbc7922deb6',1,'std::atomic_uint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8229f523dabc2103dd045fbc7922deb6',1,'atomic_uint(Global Namespace)']]], - ['atomic_5fuint16_5ft_801',['atomic_uint16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga60f6513810459148ec357bbb993ae031',1,'std::atomic_uint16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga60f6513810459148ec357bbb993ae031',1,'atomic_uint16_t(Global Namespace)']]], - ['atomic_5fuint32_5ft_802',['atomic_uint32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gafdf19d28e7b224eae4986982432e3031',1,'std::atomic_uint32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gafdf19d28e7b224eae4986982432e3031',1,'atomic_uint32_t(Global Namespace)']]], - ['atomic_5fuint64_5ft_803',['atomic_uint64_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga61a2758446aadb239e0f77a1b7e1c95d',1,'std::atomic_uint64_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga61a2758446aadb239e0f77a1b7e1c95d',1,'atomic_uint64_t(Global Namespace)']]], - ['atomic_5fuint8_5ft_804',['atomic_uint8_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga733c7b7c5f6035d86928e70083c3b74d',1,'std::atomic_uint8_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga733c7b7c5f6035d86928e70083c3b74d',1,'atomic_uint8_t(Global Namespace)']]], - ['atomic_5fuint_5ffast16_5ft_805',['atomic_uint_fast16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gab61c0b01e90d43f0213aa7abd2f5f335',1,'std::atomic_uint_fast16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gab61c0b01e90d43f0213aa7abd2f5f335',1,'atomic_uint_fast16_t(Global Namespace)']]], - ['atomic_5fuint_5ffast32_5ft_806',['atomic_uint_fast32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf84e67c027b9befda86fa336a250ad19',1,'std::atomic_uint_fast32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf84e67c027b9befda86fa336a250ad19',1,'atomic_uint_fast32_t(Global Namespace)']]], - ['atomic_5fuint_5ffast64_5ft_807',['atomic_uint_fast64_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga891df3fc547ce305e223078a002a30ae',1,'std::atomic_uint_fast64_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga891df3fc547ce305e223078a002a30ae',1,'atomic_uint_fast64_t(Global Namespace)']]], - ['atomic_5fuint_5ffast8_5ft_808',['atomic_uint_fast8_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga40baf341b0da82de1dda4f09d82e0ac5',1,'std::atomic_uint_fast8_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga40baf341b0da82de1dda4f09d82e0ac5',1,'atomic_uint_fast8_t(Global Namespace)']]], - ['atomic_5fuint_5fleast16_5ft_809',['atomic_uint_least16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga5c55fde43e38cd4b03ca13fb1a5e2a22',1,'std::atomic_uint_least16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga5c55fde43e38cd4b03ca13fb1a5e2a22',1,'atomic_uint_least16_t(Global Namespace)']]], - ['atomic_5fuint_5fleast32_5ft_810',['atomic_uint_least32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga882202b2c37d84f063452cb6919f0a72',1,'std::atomic_uint_least32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga882202b2c37d84f063452cb6919f0a72',1,'atomic_uint_least32_t(Global Namespace)']]], - ['atomic_5fuint_5fleast64_5ft_811',['atomic_uint_least64_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga90b9e9b26f9e2224e5623c59f27c36be',1,'std::atomic_uint_least64_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga90b9e9b26f9e2224e5623c59f27c36be',1,'atomic_uint_least64_t(Global Namespace)']]], - ['atomic_5fuint_5fleast8_5ft_812',['atomic_uint_least8_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga5328da93da870cab076210266f0b1ab4',1,'std::atomic_uint_least8_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga5328da93da870cab076210266f0b1ab4',1,'atomic_uint_least8_t(Global Namespace)']]], - ['atomic_5fuintmax_5ft_813',['atomic_uintmax_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga9567942c4ccb9bf8a98cc8bf9e0dd37b',1,'std::atomic_uintmax_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga9567942c4ccb9bf8a98cc8bf9e0dd37b',1,'atomic_uintmax_t(Global Namespace)']]], - ['atomic_5fuintptr_5ft_814',['atomic_uintptr_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga02e709315376fdc02556368b8035c5ac',1,'std::atomic_uintptr_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga02e709315376fdc02556368b8035c5ac',1,'atomic_uintptr_t(Global Namespace)']]], - ['atomic_5fullong_815',['atomic_ullong',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga3c5b7b2c577e1b477dc11dc501dfff44',1,'std::atomic_ullong'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga3c5b7b2c577e1b477dc11dc501dfff44',1,'atomic_ullong(Global Namespace)']]], - ['atomic_5fulong_816',['atomic_ulong',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga00ea9684fdf38053c69ad0235e67eb26',1,'std::atomic_ulong'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga00ea9684fdf38053c69ad0235e67eb26',1,'atomic_ulong(Global Namespace)']]], - ['atomic_5fushort_817',['atomic_ushort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf0c7dae0fbcf1dbaf85913a5cece6462',1,'std::atomic_ushort'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf0c7dae0fbcf1dbaf85913a5cece6462',1,'atomic_ushort(Global Namespace)']]], - ['atomic_5fwchar_5ft_818',['atomic_wchar_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga817fa93d87437b86fd8cbd6e77458631',1,'std::atomic_wchar_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga817fa93d87437b86fd8cbd6e77458631',1,'atomic_wchar_t(Global Namespace)']]], - ['atomic_5fword_2eh_819',['atomic_word.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00653.html',1,'']]], - ['atomicadd_820',['atomicAdd',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24983bb54630f3972b78a2daf7b0349a',1,'cv::cudev::atomicAdd(int *address, int val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755510388511482ae25f7496c18f2693',1,'cv::cudev::atomicAdd(uint *address, uint val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a537f36200198b96f14d70c573920ff',1,'cv::cudev::atomicAdd(float *address, float val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7541b491f2bb24961a4b77e55a32fee6',1,'cv::cudev::atomicAdd(double *address, double val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24983bb54630f3972b78a2daf7b0349a',1,'atomicAdd(int *address, int val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755510388511482ae25f7496c18f2693',1,'atomicAdd(uint *address, uint val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a537f36200198b96f14d70c573920ff',1,'atomicAdd(float *address, float val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7541b491f2bb24961a4b77e55a32fee6',1,'atomicAdd(double *address, double val)(Global Namespace)']]], - ['atomicity_2eh_821',['atomicity.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01031.html',1,'']]], - ['atomicmax_822',['atomicMax',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc9ae21a3fcf8ee75b504da0abe6da1c',1,'cv::cudev::atomicMax(int *address, int val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98ed0c7d007afb902cab16a16661a429',1,'cv::cudev::atomicMax(uint *address, uint val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa027ed0024229eced7f50b2a0896ac7e',1,'cv::cudev::atomicMax(float *address, float val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae670100963e0bf857f744d58d0666d9e',1,'cv::cudev::atomicMax(double *address, double val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc9ae21a3fcf8ee75b504da0abe6da1c',1,'atomicMax(int *address, int val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98ed0c7d007afb902cab16a16661a429',1,'atomicMax(uint *address, uint val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa027ed0024229eced7f50b2a0896ac7e',1,'atomicMax(float *address, float val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae670100963e0bf857f744d58d0666d9e',1,'atomicMax(double *address, double val)(Global Namespace)']]], - ['atomicmin_823',['atomicMin',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a9495384dfe645d9d431a26c2102572',1,'cv::cudev::atomicMin(int *address, int val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd7815fa5c09f7724139aafa44eebe9',1,'cv::cudev::atomicMin(uint *address, uint val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga016d917b9d0d81f3190f1be42953ab05',1,'cv::cudev::atomicMin(float *address, float val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b67ac13502219776cf65f38cb62975f',1,'cv::cudev::atomicMin(double *address, double val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a9495384dfe645d9d431a26c2102572',1,'atomicMin(int *address, int val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd7815fa5c09f7724139aafa44eebe9',1,'atomicMin(uint *address, uint val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga016d917b9d0d81f3190f1be42953ab05',1,'atomicMin(float *address, float val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b67ac13502219776cf65f38cb62975f',1,'atomicMin(double *address, double val)(Global Namespace)']]], - ['atomics_824',['Atomics',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html',1,'']]], - ['atread_825',['atread',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a57d7777e74ec5dd83ee3c8533927dec8',1,'cv::hdf::HDF5::atread(int *value, const String &atlabel)=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#aaeddc16f4cb1d4f1b299f477ac5b1264',1,'cv::hdf::HDF5::atread(double *value, const String &atlabel)=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a9d18050b603b806de09e9e7339c066f4',1,'cv::hdf::HDF5::atread(String *value, const String &atlabel)=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a74a8bcd8bf608a6cb2c5bde81215556a',1,'cv::hdf::HDF5::atread(OutputArray value, const String &atlabel)=0']]], - ['attachcontext_826',['attachContext',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gaf83af36be2097fd43e3eba5c8f3025b1',1,'cv::ocl::attachContext()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gaf83af36be2097fd43e3eba5c8f3025b1',1,'attachContext()(Global Namespace)']]], - ['attempts_827',['attempts',['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#a38cc72f20413df1fd2de0f2e10ef9af2',1,'cv::BOWKMeansTrainer']]], - ['attributes_828',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]], - ['atwrite_829',['atwrite',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#adee759dc8dd95d6423d9a236527dacb8',1,'cv::hdf::HDF5::atwrite(const int value, const String &atlabel)=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a8ca86bdaa18f2fa2133a5e8e76026a33',1,'cv::hdf::HDF5::atwrite(const double value, const String &atlabel)=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a656476fc6396e46c7ec309eb6aae30c3',1,'cv::hdf::HDF5::atwrite(const String &value, const String &atlabel)=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#ac62bd87e92b349d1992e770052314572',1,'cv::hdf::HDF5::atwrite(InputArray value, const String &atlabel)=0']]], - ['augassignadd_830',['augAssignAdd',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#aef1fe46a1ea6c41cf63d809b0ce548d0',1,'cv::MatOp']]], - ['augassignand_831',['augAssignAnd',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a37fae0add0d6e798ce92e557db2eeee2',1,'cv::MatOp']]], - ['augassigndivide_832',['augAssignDivide',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#aec933b6b67e03715da4dfce17d57ce15',1,'cv::MatOp']]], - ['augassignmultiply_833',['augAssignMultiply',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a2e52d774d4302c606fbc17d644eacce3',1,'cv::MatOp']]], - ['augassignor_834',['augAssignOr',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#aa32c6465441d60c7f4822fb206a426eb',1,'cv::MatOp']]], - ['augassignsubtract_835',['augAssignSubtract',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a3fd99639183ba7ee3b0b341c79cfac6b',1,'cv::MatOp']]], - ['augassignxor_836',['augAssignXor',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a56f3b1d244a55aa5b48c56478e587899',1,'cv::MatOp']]], - ['augmentedunscentedkalmanfilterparams_837',['AugmentedUnscentedKalmanFilterParams',['https://docs.opencv.org/4.2.0/d9/d0b/classcv_1_1tracking_1_1AugmentedUnscentedKalmanFilterParams.html',1,'cv::tracking::AugmentedUnscentedKalmanFilterParams'],['https://docs.opencv.org/4.2.0/d9/d0b/classcv_1_1tracking_1_1AugmentedUnscentedKalmanFilterParams.html#ab84b6588189cd1aff46b5a099aaee96e',1,'cv::tracking::AugmentedUnscentedKalmanFilterParams::AugmentedUnscentedKalmanFilterParams()'],['https://docs.opencv.org/4.2.0/d9/d0b/classcv_1_1tracking_1_1AugmentedUnscentedKalmanFilterParams.html#a26497f15b36f68ec4e105b01b2e6340c',1,'cv::tracking::AugmentedUnscentedKalmanFilterParams::AugmentedUnscentedKalmanFilterParams(int dp, int mp, int cp, double processNoiseCovDiag, double measurementNoiseCovDiag, Ptr< UkfSystemModel > dynamicalSystem, int type=CV_64F)']]], - ['auto_5fptr_838',['auto_ptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html',1,'std::auto_ptr< _Tp >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a4029546a38036de379586d8514a02ebb',1,'std::auto_ptr::auto_ptr(element_type *__p=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#aa88c998565d04c8e882a3b579e46c055',1,'std::auto_ptr::auto_ptr(auto_ptr &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a10d7a4a15c88b4953d090c08dfc87e14',1,'std::auto_ptr::auto_ptr(auto_ptr< _Tp1 > &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a829d06b1a12a622608a3cce322238fc6',1,'std::auto_ptr::auto_ptr(auto_ptr_ref< element_type > __ref)']]], - ['auto_5fptr_2eh_839',['auto_ptr.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00728.html',1,'']]], - ['auto_5fptr_5fref_840',['auto_ptr_ref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08507.html',1,'std']]], - ['auto_5fstep_841',['AUTO_STEP',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ac0da3ccbc32a8894fc03afb9cea40150a1c147538fd896f4f9abce9eaea9727e3',1,'cv::Mat::AUTO_STEP'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a6ab40566550b27870824c5e6559767c3a6a15e8efae303515b6ac5a752d688ad3',1,'cv::gapi::own::detail::MatHeader::AUTO_STEP'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#abf9262de727fd7542c5bead234fc41cea10741a8eaf539b2cb513c134641c940f',1,'cv::UMat::AUTO_STEP']]], - ['autoalign_842',['AutoAlign',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13ad0e7f67d40bcde3d41c12849b16ce6ea',1,'Eigen::AutoAlign'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13ad0e7f67d40bcde3d41c12849b16ce6ea',1,'AutoAlign(Global Namespace)']]], - ['autobuffer_843',['AutoBuffer',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'cv::AutoBuffer< _Tp, fixed_size >'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a990ab2dd088c226def0e59177933c9df',1,'cv::AutoBuffer::AutoBuffer()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ac498c6689e5a18843e1c9d23441c3a99',1,'cv::AutoBuffer::AutoBuffer(size_t _size)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3416e6aa3bb03435706abce813950d6e',1,'cv::AutoBuffer::AutoBuffer(const AutoBuffer< _Tp, fixed_size > &buf)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a990ab2dd088c226def0e59177933c9df',1,'AutoBuffer< double, 1 >::AutoBuffer()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ac498c6689e5a18843e1c9d23441c3a99',1,'AutoBuffer< double, 1 >::AutoBuffer(size_t _size)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3416e6aa3bb03435706abce813950d6e',1,'AutoBuffer< double, 1 >::AutoBuffer(const AutoBuffer< double, fixed_size > &buf)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a990ab2dd088c226def0e59177933c9df',1,'AutoBuffer< int64, 1 >::AutoBuffer()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ac498c6689e5a18843e1c9d23441c3a99',1,'AutoBuffer< int64, 1 >::AutoBuffer(size_t _size)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3416e6aa3bb03435706abce813950d6e',1,'AutoBuffer< int64, 1 >::AutoBuffer(const AutoBuffer< int64, fixed_size > &buf)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a990ab2dd088c226def0e59177933c9df',1,'AutoBuffer< String, 1 >::AutoBuffer()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ac498c6689e5a18843e1c9d23441c3a99',1,'AutoBuffer< String, 1 >::AutoBuffer(size_t _size)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3416e6aa3bb03435706abce813950d6e',1,'AutoBuffer< String, 1 >::AutoBuffer(const AutoBuffer< String, fixed_size > &buf)']]], - ['autobuffer_3c_20double_2c_201_20_3e_844',['AutoBuffer< double, 1 >',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'']]], - ['autobuffer_3c_20int64_2c_201_20_3e_845',['AutoBuffer< int64, 1 >',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'']]], - ['autobuffer_3c_20string_2c_201_20_3e_846',['AutoBuffer< String, 1 >',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'']]], - ['autocalib_2ehpp_847',['autocalib.hpp',['https://docs.opencv.org/4.2.0/d3/d45/autocalib_8hpp.html',1,'']]], - ['autocalibration_848',['Autocalibration',['https://docs.opencv.org/4.2.0/d4/dbc/group__stitching__autocalib.html',1,'']]], - ['autolock_849',['AutoLock',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaac6054394f54fbbc849a09f4286774e9',1,'cv::AutoLock'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaac6054394f54fbbc849a09f4286774e9',1,'AutoLock(Global Namespace)']]], - ['automatic_20formatting_20with_20tt_20clang_20format_20tt_850',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], - ['autonomoustask_851',['AutonomousTask',['../classautonomous_1_1AutonomousTask.html',1,'autonomous']]], - ['autotuned_5findex_2eh_852',['autotuned_index.h',['https://docs.opencv.org/4.2.0/d1/dc3/autotuned__index_8h.html',1,'']]], - ['available_853',['available',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a702ddb75d538501184c313b56b576e7f',1,'cv::ocl::Device']]], - ['avcapturevideodataoutputsamplebufferdelegate_2dp_2dp_854',['AVCaptureVideoDataOutputSampleBufferDelegate-p-p',['https://docs.opencv.org/4.2.0/d7/dc6/classAVCaptureVideoDataOutputSampleBufferDelegate-p.html',1,'']]], - ['avepoolpaddedarea_855',['avePoolPaddedArea',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a6138276571a0cf1f4c9ac1335c7f75b8',1,'cv::dnn::PoolingLayer']]], - ['average_5fhash_2ehpp_856',['average_hash.hpp',['https://docs.opencv.org/4.2.0/d7/d22/average__hash_8hpp.html',1,'']]], - ['averagehash_857',['AverageHash',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1img__hash_1_1AverageHash.html',1,'cv::img_hash::AverageHash'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1img__hash_1_1AverageHash.html#af8ebaf26ead55018ebb9bca5ba0ef761',1,'cv::img_hash::AverageHash::AverageHash()']]], - ['averagehash_858',['averageHash',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga482a3fdcb92bfff57cdc2aed2b5bc47e',1,'cv::img_hash::averageHash()'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga482a3fdcb92bfff57cdc2aed2b5bc47e',1,'averageHash()(Global Namespace)']]], - ['avg_859',['Avg',['https://docs.opencv.org/4.2.0/da/dad/structcv_1_1cudev_1_1Avg.html',1,'cv::cudev']]], - ['avgbitrate_860',['AvgBitrate',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a0c6d0900fbb3241b1d80c8c46b2b9825',1,'cv::cudacodec::EncoderParams']]], - ['avireadcontainer_861',['AVIReadContainer',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html',1,'cv::AVIReadContainer'],['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#aeeb6d710add21767b1e9baa67e171c09',1,'cv::AVIReadContainer::AVIReadContainer()']]], - ['aviwritecontainer_862',['AVIWriteContainer',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html',1,'cv::AVIWriteContainer'],['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a3a71f42925fe83e518c3fcc425cc6297',1,'cv::AVIWriteContainer::AVIWriteContainer()']]], - ['awk_863',['awk',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a1de0f54830ba2d86ca5244f8609fef2c',1,'std::regex_constants']]], - ['ax_5flbx_864',['Ax_lBx',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a5eb11a88a4bd445f58f1b24598d3848f',1,'Eigen::Ax_lBx'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a5eb11a88a4bd445f58f1b24598d3848f',1,'Ax_lBx(Global Namespace)']]], - ['axes_865',['axes',['https://docs.opencv.org/4.2.0/d2/d71/classcv_1_1xfeatures2d_1_1Elliptic__KeyPoint.html#acc9ec69d02052ee9fc5634c2c2ea4534',1,'cv::xfeatures2d::Elliptic_KeyPoint']]], - ['axis_866',['axis',['https://docs.opencv.org/4.2.0/da/d5c/classcv_1_1dnn_1_1ConcatLayer.html#a1f11c2cdc4398cd0bd5875233ee1a256',1,'cv::dnn::ConcatLayer::axis'],['https://docs.opencv.org/4.2.0/d0/dc7/classcv_1_1dnn_1_1InnerProductLayer.html#a802e2eecf90aec44f37c8e26501b7805',1,'cv::dnn::InnerProductLayer::axis'],['https://docs.opencv.org/4.2.0/dd/dde/classcv_1_1dnn_1_1ScaleLayer.html#adff905f1897b2726e9e7b93095058c76',1,'cv::dnn::ScaleLayer::axis'],['https://docs.opencv.org/4.2.0/de/d61/classcv_1_1dnn_1_1SliceLayer.html#a2feb2f10f8ea482f35851dcd1890f9ee',1,'cv::dnn::SliceLayer::axis'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a6fe6a68ebe395dd43953592813cdeee5',1,'Eigen::AngleAxis::axis()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#aeb281dd2ac2332c876da30ee708f15fe',1,'Eigen::AngleAxis::axis() const']]], - ['azure_867',['azure',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a694182da3ec2c3895d44455e81d3841b',1,'cv::viz::Color']]] + ['algorithm_257',['ALGORITHM',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aacc42f38c94fd1898b9e8a14132d94261',1,'ALGORITHM(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aacc42f38c94fd1898b9e8a14132d94261',1,'ALGORITHM(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aacc42f38c94fd1898b9e8a14132d94261',1,'ALGORITHM(Global Namespace)']]], + ['algorithm_258',['Algorithm',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html',1,'cv::Algorithm'],['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a827c8b2781ed17574805f373e6054ff1',1,'cv::Algorithm::Algorithm()'],['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html',1,'Experimental 2D Features Matching Algorithm'],['https://docs.opencv.org/4.2.0/dd/dfc/tutorial_js_grabcut.html',1,'Foreground Extraction using GrabCut Algorithm'],['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'Image Segmentation with Distance Transform and Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d3/db4/tutorial_py_watershed.html',1,'Image Segmentation with Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d7/d1c/tutorial_js_watershed.html',1,'Image Segmentation with Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d8/d83/tutorial_py_grabcut.html',1,'Interactive Foreground Extraction using GrabCut Algorithm']]], + ['algorithm_259',['algorithm',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00038.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/dcb/tutorial_xphoto_training_white_balance.html',1,'Training the learning-based white balance algorithm']]], + ['algorithm_20for_20corner_20detection_260',['FAST Algorithm for Corner Detection',['https://docs.opencv.org/4.2.0/df/d0c/tutorial_py_fast.html',1,'']]], + ['algorithm_20to_20the_20facemark_20api_261',['Adding a new algorithm to the Facemark API',['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'']]], + ['algorithm_20with_20g_20api_262',['Implementing a face beautification algorithm with G-API',['https://docs.opencv.org/4.2.0/d4/d48/tutorial_gapi_face_beautification.html',1,'']]], + ['algorithms_263',['Algorithms',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01488.html',1,'Algorithms'],['https://docs.opencv.org/4.2.0/d7/d7a/group__xfeatures2d__experiment.html',1,'Experimental 2D Features Algorithms'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html',1,'Non-free 2D Features Algorithms'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html',1,'Optical Flow Algorithms'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html',1,'Optimization Algorithms'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html',1,'Stereo Correspondance Algorithms']]], + ['algorithms_264',['algorithms',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html',1,'Additional photo processing algorithms'],['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'STL iterators and algorithms'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'The module brings implementations of different image hashing algorithms.']]], + ['aliasing_265',['Aliasing',['https://eigen.tuxfamily.org/dox/group__TopicAliasing.html',1,'Aliasing'],['https://eigen.tuxfamily.org/dox/TopicLazyEvaluation.html',1,'Lazy Evaluation and Aliasing']]], + ['align_266',['align',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7a0544b4d4e49cb7f4668d8ce7b914d5',1,'std']]], + ['aligned_267',['Aligned',['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1ae12d0f8f869c40c76128260af2242bc8',1,'Eigen::Aligned'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1ae12d0f8f869c40c76128260af2242bc8',1,'Aligned(Global Namespace)']]], + ['aligned_20box_20typedefs_268',['Global aligned box typedefs',['https://eigen.tuxfamily.org/dox/group__alignedboxtypedefs.html',1,'']]], + ['aligned128_269',['Aligned128',['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a60057da2408e499b5656244d0b26cc20',1,'Eigen::Aligned128'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a60057da2408e499b5656244d0b26cc20',1,'Aligned128(Global Namespace)']]], + ['aligned16_270',['Aligned16',['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1ad0b140cd97bc74365b51843d28379655',1,'Eigen::Aligned16'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1ad0b140cd97bc74365b51843d28379655',1,'Aligned16(Global Namespace)']]], + ['aligned32_271',['Aligned32',['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a8a380b1cd0c3e5a6cceac06f8235157a',1,'Eigen::Aligned32'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a8a380b1cd0c3e5a6cceac06f8235157a',1,'Aligned32(Global Namespace)']]], + ['aligned64_272',['Aligned64',['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a2639cfa1e8faac751556bc0009fe95a4',1,'Eigen::Aligned64'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a2639cfa1e8faac751556bc0009fe95a4',1,'Aligned64(Global Namespace)']]], + ['aligned8_273',['Aligned8',['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a9d99d7a9ff1da5c949bec22733bfba14',1,'Eigen::Aligned8'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga45fe06e29902b7a2773de05ba27b47a1a9d99d7a9ff1da5c949bec22733bfba14',1,'Aligned8(Global Namespace)']]], + ['aligned_5fallocator_274',['aligned_allocator',['https://eigen.tuxfamily.org/dox/classEigen_1_1aligned__allocator.html',1,'Eigen']]], + ['aligned_5fbuffer_2eh_275',['aligned_buffer.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01025.html',1,'']]], + ['aligned_5fstorage_276',['aligned_storage',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04195.html',1,'std']]], + ['aligned_5fstorage_3c_20sizeof_28_5fm_5fptr_29_2c_20alignof_28void_20_2a_29_3e_277',['aligned_storage< sizeof(_M_ptr), alignof(void *)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04195.html',1,'']]], + ['aligned_5fstorage_3c_20sizeof_28_5fres_29_2c_20_5f_5falignof_5f_5f_28_5fres_29_3e_278',['aligned_storage< sizeof(_Res), __alignof__(_Res)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04195.html',1,'']]], + ['aligned_5fstorage_3c_20sizeof_28_5ftp_29_2c_20_5f_5falignof_5f_5f_28_5ftp_29_3e_279',['aligned_storage< sizeof(_Tp), __alignof__(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04195.html',1,'']]], + ['aligned_5fstorage_3c_20sizeof_28_5ftp_29_2c_20alignof_28_5ftp_29_3e_280',['aligned_storage< sizeof(_Tp), alignof(_Tp)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04195.html',1,'']]], + ['aligned_5fstorage_3c_20sizeof_28_5fvalue_29_2c_20_5f_5falignof_5f_5f_28_5fvalue_29_3e_281',['aligned_storage< sizeof(_Value), __alignof__(_Value)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04195.html',1,'']]], + ['aligned_5fstorage_5ft_282',['aligned_storage_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga333ed0641a23a64d26590875fab8bd64',1,'std::aligned_storage_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga333ed0641a23a64d26590875fab8bd64',1,'aligned_storage_t(Global Namespace)']]], + ['aligned_5funion_283',['aligned_union',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04211.html',1,'std']]], + ['alignedbit_284',['AlignedBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gab1088154b1bb147229211e4f3b56d401',1,'Eigen::AlignedBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gab1088154b1bb147229211e4f3b56d401',1,'AlignedBit(Global Namespace)']]], + ['alignedbox_285',['AlignedBox',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html',1,'Eigen::AlignedBox< class, _AmbientDim >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a43aba4c646424355dd39864655a3386f',1,'Eigen::AlignedBox::AlignedBox()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a05f7ca06a060c8d4d2e910870669538c',1,'Eigen::AlignedBox::AlignedBox(const AlignedBox< OtherScalarType, AmbientDimAtCompileTime > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a77f5058435889bf0dfe84bdbd158f10b',1,'Eigen::AlignedBox::AlignedBox(const MatrixBase< Derived > &p)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#abbda47b393f17094998da5cdcb73df28',1,'Eigen::AlignedBox::AlignedBox(const OtherVectorType1 &_min, const OtherVectorType2 &_max)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ade9f3bc760956c19d9c087b3a9cd6389',1,'Eigen::AlignedBox::AlignedBox(Index _dim)']]], + ['alignedscaling2d_286',['AlignedScaling2d',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af8975289b8134a5021e806029516e82c',1,'Eigen']]], + ['alignedscaling2f_287',['AlignedScaling2f',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af2440178a1f5f6abef6ee0231bc49184',1,'Eigen']]], + ['alignedscaling3d_288',['AlignedScaling3d',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a0aff001d5740f13797c9acd4e3276673',1,'Eigen']]], + ['alignedscaling3f_289',['AlignedScaling3f',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a45caf8b0e6da378885f4ae3f06c5cde3',1,'Eigen']]], + ['alignexposures_290',['AlignExposures',['https://docs.opencv.org/4.2.0/d4/df2/classcv_1_1AlignExposures.html',1,'cv']]], + ['alignment_291',['alignment',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#a22bbeb73256c4b87069e4fccc217924e',1,'INCVMemAllocator::alignment()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#a94fe530e7467669889e68815a4d0f35f',1,'NCVMemNativeAllocator::alignment()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#af15faac5f28b4dd4951a99a1f0253ace',1,'NCVMemStackAllocator::alignment()'],['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'Compiler making a wrong assumption on stack alignment']]], + ['alignment_20issues_292',['Alignment issues',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__Alignement.html',1,'']]], + ['alignment_5fof_293',['alignment_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03871.html',1,'std']]], + ['alignment_5fvalue_294',['alignment_value',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga02d39c3e7eff3fb5ccdf9878ebfad0ef',1,'std::aligned_union::alignment_value'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga02d39c3e7eff3fb5ccdf9878ebfad0ef',1,'alignment_value(Global Namespace)']]], + ['alignmenttype_295',['AlignmentType',['https://eigen.tuxfamily.org/dox/group__enums.html#ga45fe06e29902b7a2773de05ba27b47a1',1,'Eigen::AlignmentType'],['https://eigen.tuxfamily.org/dox/group__enums.html#ga45fe06e29902b7a2773de05ba27b47a1',1,'AlignmentType(Global Namespace)']]], + ['alignmtb_296',['AlignMTB',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html',1,'cv']]], + ['alignptr_297',['alignPtr',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga138b3f05c8a26bc74038142b4367cc31',1,'cv::alignPtr()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga138b3f05c8a26bc74038142b4367cc31',1,'alignPtr()(Global Namespace)']]], + ['alignsize_298',['alignSize',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf2ff8f837e7a44f288b050765492f800',1,'cv::alignSize()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf2ff8f837e7a44f288b050765492f800',1,'alignSize(size_t sz, int n)(Global Namespace)']]], + ['alignup_299',['alignUp',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga2276f3c6846b8eea554dea05a4f39664',1,]]], + ['all_300',['all',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#ad2ddc152ed732bc16528984b71f1066d',1,'std::locale::all'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'cv::Matx::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< _Tp, cn, 1 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, 1, 3 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, 2, 2 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, 2, 3 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, 3, 3 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, 3, 4 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, 4, 4 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< double, cn, 1 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< float, 2, 3 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< float, 3, 3 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< float, cn, 1 >::all()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa72b89d5454c4b0b66b5667e1999e35a',1,'Matx< float_type, 4, 4 >::all()'],['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#af5a0207f6f98a69077db8e77898abc0f',1,'cv::Range::all()'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#a2180785ecd8ffae4e9b67b81d64b4662',1,'cv::gapi::own::Scalar::all()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ac1509a4b8454fe7fe29db069e13a2e6f',1,'cv::Scalar_::all()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ac1509a4b8454fe7fe29db069e13a2e6f',1,'Scalar_< double >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'cv::Vec::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< _Tp, 4 >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< double, 2 >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< double, 3 >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< double, 4 >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< double, nFeatures >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< float, 2 >::all()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a86371c4948f9dbb4496cfd7a559c51b4',1,'Vec< float, 3 >::all()'],['https://docs.opencv.org/4.2.0/dc/df8/structcv_1_1cudev_1_1VecTraits_3_01char1_01_4.html#a4578bc33d69ea3d130310d48875fc526',1,'cv::cudev::VecTraits< char1 >::all()'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1cudev_1_1VecTraits_3_01char2_01_4.html#a9885d810ad93ba9e8d545620377b94b5',1,'cv::cudev::VecTraits< char2 >::all()'],['https://docs.opencv.org/4.2.0/df/de4/structcv_1_1cudev_1_1VecTraits_3_01char3_01_4.html#aff3f7d757d5e109d83d338d249c50523',1,'cv::cudev::VecTraits< char3 >::all()'],['https://docs.opencv.org/4.2.0/dc/df6/structcv_1_1cudev_1_1VecTraits_3_01char4_01_4.html#adfffd96f3d074ba2741bc8b58864743b',1,'cv::cudev::VecTraits< char4 >::all()'],['https://docs.opencv.org/4.2.0/d1/d4e/structcv_1_1cudev_1_1VecTraits_3_01double_01_4.html#aacbc12f1935139202d7558a505c79ac0',1,'cv::cudev::VecTraits< double >::all()'],['https://docs.opencv.org/4.2.0/d1/de1/structcv_1_1cudev_1_1VecTraits_3_01double1_01_4.html#ad460720fd3156df9967df2536bb29e16',1,'cv::cudev::VecTraits< double1 >::all()'],['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1VecTraits_3_01double2_01_4.html#ae77c7a246b5a30f675053fb0d4b123eb',1,'cv::cudev::VecTraits< double2 >::all()'],['https://docs.opencv.org/4.2.0/d5/d24/structcv_1_1cudev_1_1VecTraits_3_01double3_01_4.html#a79aebc1e2d78351253564bcd431faef6',1,'cv::cudev::VecTraits< double3 >::all()'],['https://docs.opencv.org/4.2.0/d1/d5d/structcv_1_1cudev_1_1VecTraits_3_01double4_01_4.html#a76faae25f6e04d64ca7e60ac737b1847',1,'cv::cudev::VecTraits< double4 >::all()'],['https://docs.opencv.org/4.2.0/d0/d48/structcv_1_1cudev_1_1VecTraits_3_01float_01_4.html#a7f07898f6180edf224bdb4686eabb52c',1,'cv::cudev::VecTraits< float >::all()'],['https://docs.opencv.org/4.2.0/dc/d22/structcv_1_1cudev_1_1VecTraits_3_01float1_01_4.html#abca766fc324aadc390d2e4712e685410',1,'cv::cudev::VecTraits< float1 >::all()'],['https://docs.opencv.org/4.2.0/d9/dfe/structcv_1_1cudev_1_1VecTraits_3_01float2_01_4.html#abd109bd23ad2ee9d75517a40954e1f97',1,'cv::cudev::VecTraits< float2 >::all()'],['https://docs.opencv.org/4.2.0/d9/d1a/structcv_1_1cudev_1_1VecTraits_3_01float3_01_4.html#abb8882b314dda3059e20918499623dbe',1,'cv::cudev::VecTraits< float3 >::all()'],['https://docs.opencv.org/4.2.0/d9/d9c/structcv_1_1cudev_1_1VecTraits_3_01float4_01_4.html#a162d2b4e1a5b5c4133355045fbc139ea',1,'cv::cudev::VecTraits< float4 >::all()'],['https://docs.opencv.org/4.2.0/d7/dc2/structcv_1_1cudev_1_1VecTraits_3_01int1_01_4.html#ae6889183c06b6c14bdc7226e2797eeb9',1,'cv::cudev::VecTraits< int1 >::all()'],['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1VecTraits_3_01int2_01_4.html#a8bb81f3e32b5c2e354cb79b679035d0b',1,'cv::cudev::VecTraits< int2 >::all()'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1VecTraits_3_01int3_01_4.html#aff4fbacb92cfd1c6d6688f02249b66ad',1,'cv::cudev::VecTraits< int3 >::all()'],['https://docs.opencv.org/4.2.0/da/d75/structcv_1_1cudev_1_1VecTraits_3_01int4_01_4.html#a951b1abed95359992723844f2b028708',1,'cv::cudev::VecTraits< int4 >::all()'],['https://docs.opencv.org/4.2.0/d4/d43/structcv_1_1cudev_1_1VecTraits_3_01schar_01_4.html#aa075b3508fe7f4b282335628a47f1feb',1,'cv::cudev::VecTraits< schar >::all()'],['https://docs.opencv.org/4.2.0/da/df0/structcv_1_1cudev_1_1VecTraits_3_01short_01_4.html#a64af111068a8e1d7238730a4bb373d91',1,'cv::cudev::VecTraits< short >::all()'],['https://docs.opencv.org/4.2.0/d6/dec/structcv_1_1cudev_1_1VecTraits_3_01short1_01_4.html#a92ef99b52d2ef23128d227a8c6bae6d7',1,'cv::cudev::VecTraits< short1 >::all()'],['https://docs.opencv.org/4.2.0/dd/d78/structcv_1_1cudev_1_1VecTraits_3_01short2_01_4.html#a0257404018eced54da612eb8502d3a1e',1,'cv::cudev::VecTraits< short2 >::all()'],['https://docs.opencv.org/4.2.0/da/d6d/structcv_1_1cudev_1_1VecTraits_3_01short3_01_4.html#afd25f0d73679d780d4a28c46adf6843d',1,'cv::cudev::VecTraits< short3 >::all()'],['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1VecTraits_3_01short4_01_4.html#a674ed3369b1e709ee228cd4624e250bb',1,'cv::cudev::VecTraits< short4 >::all()'],['https://docs.opencv.org/4.2.0/df/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar_01_4.html#affc0692bcc1ba6040895264c611c6dfc',1,'cv::cudev::VecTraits< uchar >::all()'],['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar1_01_4.html#ab591bf25d8d2b025b82f86da4cb3e856',1,'cv::cudev::VecTraits< uchar1 >::all()'],['https://docs.opencv.org/4.2.0/d0/da8/structcv_1_1cudev_1_1VecTraits_3_01uchar2_01_4.html#a1e1f2afe6614057a9d47f8d03f8eeabb',1,'cv::cudev::VecTraits< uchar2 >::all()'],['https://docs.opencv.org/4.2.0/da/d8a/structcv_1_1cudev_1_1VecTraits_3_01uchar3_01_4.html#a790bce11b0ef688f8790dfff27344e13',1,'cv::cudev::VecTraits< uchar3 >::all()'],['https://docs.opencv.org/4.2.0/d4/dc1/structcv_1_1cudev_1_1VecTraits_3_01uchar4_01_4.html#afb83b8eb0beda15d3a5f7cf6aaa4e27b',1,'cv::cudev::VecTraits< uchar4 >::all()'],['https://docs.opencv.org/4.2.0/de/d87/structcv_1_1cudev_1_1VecTraits_3_01uint_01_4.html#a84fb06944258033a3a04c1cd52a392d9',1,'cv::cudev::VecTraits< uint >::all()'],['https://docs.opencv.org/4.2.0/de/d41/structcv_1_1cudev_1_1VecTraits_3_01uint1_01_4.html#a6299d51c5215c26bd4277ed7a341ee27',1,'cv::cudev::VecTraits< uint1 >::all()'],['https://docs.opencv.org/4.2.0/d7/d19/structcv_1_1cudev_1_1VecTraits_3_01uint2_01_4.html#ab18dfb18808e464a20376fd8e6f40cdf',1,'cv::cudev::VecTraits< uint2 >::all()'],['https://docs.opencv.org/4.2.0/da/d00/structcv_1_1cudev_1_1VecTraits_3_01uint3_01_4.html#a13be20b30a144422a4553c74a1641e5c',1,'cv::cudev::VecTraits< uint3 >::all()'],['https://docs.opencv.org/4.2.0/dc/d7c/structcv_1_1cudev_1_1VecTraits_3_01uint4_01_4.html#adcbbade6526b4b9c656fbdb8e1ee405d',1,'cv::cudev::VecTraits< uint4 >::all()'],['https://docs.opencv.org/4.2.0/d9/db8/structcv_1_1cudev_1_1VecTraits_3_01ushort_01_4.html#a61b42ec7a21f760aef2b3006fb355c41',1,'cv::cudev::VecTraits< ushort >::all()'],['https://docs.opencv.org/4.2.0/da/d76/structcv_1_1cudev_1_1VecTraits_3_01ushort1_01_4.html#afa51d96bbde6bb179782cd7d9a41af6c',1,'cv::cudev::VecTraits< ushort1 >::all()'],['https://docs.opencv.org/4.2.0/d0/d40/structcv_1_1cudev_1_1VecTraits_3_01ushort2_01_4.html#a3cd2ea69878c615686526f092b7efbf1',1,'cv::cudev::VecTraits< ushort2 >::all()'],['https://docs.opencv.org/4.2.0/d4/dd7/structcv_1_1cudev_1_1VecTraits_3_01ushort3_01_4.html#a3bd8aa9d7c7abd02d6ccfa48cdf38567',1,'cv::cudev::VecTraits< ushort3 >::all()'],['https://docs.opencv.org/4.2.0/d3/d14/structcv_1_1cudev_1_1VecTraits_3_01ushort4_01_4.html#aa70e62cd84c3e5e3448ae64e575e206a',1,'cv::cudev::VecTraits< ushort4 >::all()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a19aaf012161f62da7b7c26fe03aafe79',1,'std::bitset::all()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#afc6c0cbe1e68203c79c039c3c38e8c3e',1,'std::tr2::dynamic_bitset::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae42ab60296c120e9f45ce3b44e1761a4',1,'Eigen::DenseBase::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae42ab60296c120e9f45ce3b44e1761a4',1,'DenseBase< ArrayWrapper< ExpressionType > >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae42ab60296c120e9f45ce3b44e1761a4',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae42ab60296c120e9f45ce3b44e1761a4',1,'DenseBase< Solve< Decomposition, RhsType > >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'Eigen::VectorwiseOp::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const Derived, Horizontal >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const Derived, Vertical >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::all()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9c2b4740bf190492bf231d8e244b25c1',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::all()'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html#ga790ab6c4226ef5f678b9eb532a3eab14',1,'Eigen::all'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html#ga790ab6c4226ef5f678b9eb532a3eab14',1,'all(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145aa181a603769c1f98ad927e7367c7aa51',1,'all(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga0a1765c6b0d8d734be3d54d85be9f145aa181a603769c1f98ad927e7367c7aa51',1,'all(Global Namespace)']]], + ['all_5findices_2eh_301',['all_indices.h',['https://docs.opencv.org/4.2.0/d0/deb/all__indices_8h.html',1,'']]], + ['all_5flayers_2ehpp_302',['all_layers.hpp',['https://docs.opencv.org/4.2.0/dd/d6b/all__layers_8hpp.html',1,'']]], + ['all_5fof_303',['all_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaaef2d0f2f0d6942636f6f42eb940b850',1,'std::all_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaaef2d0f2f0d6942636f6f42eb940b850',1,'all_of()(Global Namespace)']]], + ['allfinite_304',['allFinite',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1e669fd3aaae50a4870dc1b8f3b8884',1,'Eigen::DenseBase::allFinite()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1e669fd3aaae50a4870dc1b8f3b8884',1,'DenseBase< ArrayWrapper< ExpressionType > >::allFinite()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1e669fd3aaae50a4870dc1b8f3b8884',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::allFinite()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1e669fd3aaae50a4870dc1b8f3b8884',1,'DenseBase< Solve< Decomposition, RhsType > >::allFinite()']]], + ['alloc_305',['alloc',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#a4b1432cac3a276d4ae3e98cce84484ca',1,'INCVMemAllocator::alloc()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#a5f9fc6b038d5358d70ee45c4877e1e65',1,'NCVMemNativeAllocator::alloc()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#a657183cac71dc8437d78b167e4a884e6',1,'NCVMemStackAllocator::alloc()']]], + ['alloc_5ftype_306',['alloc_type',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#adafb6e996e9e7a0d6c4696b6a186600e',1,'cv::cuda::HostMem']]], + ['allocate_307',['allocate',['https://docs.opencv.org/4.2.0/df/d98/classcv_1_1cuda_1_1GpuMat_1_1Allocator.html#aaae55175c4bcd6485928b68dde3f2730',1,'cv::cuda::GpuMat::Allocator::allocate()'],['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a9b8f24e0dae966eb6ba996ff0dba2a19',1,'cv::Allocator::allocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a1c16dbf31a16748ffc930e796f0dc54b',1,'cv::AutoBuffer::allocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a1c16dbf31a16748ffc930e796f0dc54b',1,'AutoBuffer< double, 1 >::allocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a1c16dbf31a16748ffc930e796f0dc54b',1,'AutoBuffer< int64, 1 >::allocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a1c16dbf31a16748ffc930e796f0dc54b',1,'AutoBuffer< String, 1 >::allocate()'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#aa45256af121fb6573c665adb113b68b8',1,'cv::MatAllocator::allocate(int dims, const int *sizes, int type, void *data, size_t *step, AccessFlag flags, UMatUsageFlags usageFlags) const=0'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#acffc4f4d2141b44aff63cc136d79e494',1,'cv::MatAllocator::allocate(UMatData *data, AccessFlag accessflags, UMatUsageFlags usageFlags) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#affb80bd4db40e98a88dfef90fca171f0',1,'__alloc_traits< _Tp_alloc_type >::allocate(_Tp_alloc_type &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a197382ef13610c2b6aa052659de425e7',1,'__alloc_traits< _Tp_alloc_type >::allocate(_Tp_alloc_type &__a, size_type __n, const_void_pointer __hint)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#affb80bd4db40e98a88dfef90fca171f0',1,'__alloc_traits< _Tp_alloc_type >::allocate(_Tp_alloc_type &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a197382ef13610c2b6aa052659de425e7',1,'__alloc_traits< _Tp_alloc_type >::allocate(_Tp_alloc_type &__a, size_type __n, const_void_pointer __hint)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#affb80bd4db40e98a88dfef90fca171f0',1,'__gnu_cxx::__alloc_traits::allocate(_Alloc &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a197382ef13610c2b6aa052659de425e7',1,'__gnu_cxx::__alloc_traits::allocate(_Alloc &__a, size_type __n, const_void_pointer __hint)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#affb80bd4db40e98a88dfef90fca171f0',1,'__gnu_cxx::__alloc_traits::allocate(_Alloc &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a197382ef13610c2b6aa052659de425e7',1,'__gnu_cxx::__alloc_traits::allocate(_Alloc &__a, size_type __n, const_void_pointer __hint)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#affb80bd4db40e98a88dfef90fca171f0',1,'allocator_traits< _Tp_alloc_type >::allocate(_Tp_alloc_type &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a197382ef13610c2b6aa052659de425e7',1,'allocator_traits< _Tp_alloc_type >::allocate(_Tp_alloc_type &__a, size_type __n, const_void_pointer __hint)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#affb80bd4db40e98a88dfef90fca171f0',1,'std::allocator_traits::allocate(_Alloc &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a197382ef13610c2b6aa052659de425e7',1,'std::allocator_traits::allocate(_Alloc &__a, size_type __n, const_void_pointer __hint)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a2fc200b5597fdfa4f0c65d1198cfbbe0',1,'std::allocator_traits< allocator< _Tp > >::allocate(allocator_type &__a, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a2c50858a50201af5dcb94c660d3f426b',1,'std::allocator_traits< allocator< _Tp > >::allocate(allocator_type &__a, size_type __n, const_void_pointer __hint)']]], + ['allocate_5fshared_308',['allocate_shared',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< _Dir >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< _Dir_stack >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< _RegexT >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< _State >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< _State_base >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< _State_type >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< const __detail::_NFA< _Rx_traits > >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'shared_ptr< std::mutex >::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html#aae3d23f345adfb0284614b4d1bfdd7b3',1,'std::shared_ptr::allocate_shared'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga84894e14d771a93b933577b3f8f191cc',1,'std::allocate_shared()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga84894e14d771a93b933577b3f8f191cc',1,'allocate_shared(const _Alloc &__a, _Args &&... __args)(Global Namespace)']]], + ['allocated_5fptr_2eh_309',['allocated_ptr.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00269.html',1,'']]], + ['allocator_310',['Allocator',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html',1,'cv::Allocator< class >'],['https://docs.opencv.org/4.2.0/df/d98/classcv_1_1cuda_1_1GpuMat_1_1Allocator.html',1,'cv::cuda::GpuMat::Allocator'],['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#aafdbd199d4af478deaf145db3ecf40b9',1,'cv::Allocator::Allocator()'],['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a46bfa8003a58d0938831392cb4e257b8',1,'cv::Allocator::Allocator(Allocator const &)'],['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a39bfd5315c0572eb6e89bb62177f439e',1,'cv::Allocator::Allocator(Allocator< U > const &)']]], + ['allocator_311',['allocator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04767.html',1,'std::allocator< _Tp >'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a1dc1f7a23c89d2a36f0efc7db1b0d5a4',1,'cv::cuda::GpuMat::allocator'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a4d2eb7a536cd5a0f18808b6112111d6a',1,'cv::Mat::allocator'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a1fb3a925c15a454a5edba1cb0f0008fd',1,'cv::UMat::allocator']]], + ['allocator_2eh_312',['allocator.h',['https://docs.opencv.org/4.2.0/da/da9/allocator_8h.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00272.html',1,'(Global Namespace)']]], + ['allocator_3c_20value_5ftype_20_3e_313',['allocator< value_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04767.html',1,'']]], + ['allocator_3c_20void_20_3e_314',['allocator< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04759.html',1,'std']]], + ['allocator_5farg_5ft_315',['allocator_arg_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08063.html',1,'std']]], + ['allocator_5fstats_2ehpp_316',['allocator_stats.hpp',['https://docs.opencv.org/4.2.0/de/da8/allocator__stats_8hpp.html',1,'']]], + ['allocator_5ftraits_317',['allocator_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html',1,'std']]], + ['allocator_5ftraits_3c_20_5ftp_5falloc_5ftype_20_3e_318',['allocator_traits< _Tp_alloc_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html',1,'']]], + ['allocator_5ftraits_3c_20allocator_3c_20_5ftp_20_3e_20_3e_319',['allocator_traits< allocator< _Tp > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html',1,'std']]], + ['allocator_5ftype_320',['allocator_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#a9daab8bbfe3a02a6241b4e0a7354d3f9',1,'__gnu_pbds::trie_prefix_search_node_update::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#afca1125c7f138bdffa1fda17a5181429',1,'allocator_traits< _Tp_alloc_type >::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#afca1125c7f138bdffa1fda17a5181429',1,'std::allocator_traits::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a235dca414a6b10eb9434eb7bba492c5e',1,'std::allocator_traits< allocator< _Tp > >::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3cfe51976315c0c1fbe62ac14c98e1f7',1,'std::set::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3cfe51976315c0c1fbe62ac14c98e1f7',1,'std::set::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a434ca8d37d3262f336f06903abbd170b',1,'std::unordered_map::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a434ca8d37d3262f336f06903abbd170b',1,'std::unordered_map::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aab5213cbfd6797faef226b949240b8ec',1,'std::unordered_multimap::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aab5213cbfd6797faef226b949240b8ec',1,'std::unordered_multimap::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a37fd3cf11429a513cea1f132c06e87df',1,'std::unordered_multiset::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a37fd3cf11429a513cea1f132c06e87df',1,'std::unordered_multiset::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a9bba281b4f65b14513a532e398d37642',1,'std::unordered_set::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a9bba281b4f65b14513a532e398d37642',1,'std::unordered_set::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a434ca8d37d3262f336f06903abbd170b',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::allocator_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a434ca8d37d3262f336f06903abbd170b',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::allocator_type'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad38ae80f1e99d4b1f33c99fea4611457.html#ad38ae80f1e99d4b1f33c99fea4611457',1,'nlohmann::basic_json::allocator_type']]], + ['allocatorflags_5f_321',['allocatorFlags_',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a398a4153df8d1af5fd5a26996d1b4684',1,'cv::UMatData']]], + ['allocators_322',['Allocators',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01499.html',1,'']]], + ['allocatorstatisticsinterface_323',['AllocatorStatisticsInterface',['https://docs.opencv.org/4.2.0/df/d6f/classcv_1_1utils_1_1AllocatorStatisticsInterface.html',1,'cv::utils::AllocatorStatisticsInterface'],['https://docs.opencv.org/4.2.0/df/d6f/classcv_1_1utils_1_1AllocatorStatisticsInterface.html#a9ee754891f9a2124a947d9de238b414b',1,'cv::utils::AllocatorStatisticsInterface::AllocatorStatisticsInterface()']]], + ['alloctype_324',['AllocType',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#aa0d69b2aa95680a6b2af6dc4dda44e16',1,'cv::cuda::HostMem']]], + ['almostequal_325',['almostEqual',['../namespaceutil.html#a59535c29b1922ba23f28bdd79857da8e',1,'util']]], + ['alpha_326',['alpha',['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html#aff241ba0858b3f99e24204e66f2db61b',1,'cv::gapi::wip::draw::Image::alpha'],['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#af6eb8d2f7b89b29e7db7e06e87933702',1,'cv::dnn::LRNLayer::alpha'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad15093b928c0af84cc1e88179ef4d638',1,'cv::MatExpr::alpha'],['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#a2ee61847b904d29e7b74b9ceac701bd2',1,'NCVBroxOpticalFlowDescriptor::alpha'],['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html#a37db0abb88725d4ea0f1d3dceadec3ea',1,'cv::TrackerSamplerPF::Params::alpha'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a580ada1c13cd18bcf218674f6d606c39',1,'cv::ppf_match_3d::Pose3D::alpha'],['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a306263e21a28caced1bad68eed80a73e',1,'cv::tracking::UnscentedKalmanFilterParams::alpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a885140ca6e119c2c66130bcdd388038c',1,'gamma_distribution< double >::alpha()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a885140ca6e119c2c66130bcdd388038c',1,'gamma_distribution< result_type >::alpha()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a885140ca6e119c2c66130bcdd388038c',1,'std::gamma_distribution::alpha()']]], + ['alpha1_327',['alpha1',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#a6a2d268e500d32574ed00ff4da454f07',1,'cv::cuda::FGDParams']]], + ['alpha2_328',['alpha2',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#abaf4902f6c9be62f8580e7800242019d',1,'cv::cuda::FGDParams']]], + ['alpha3_329',['alpha3',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#a8d81aaed6cc97471c18946dd152a1e06',1,'cv::cuda::FGDParams']]], + ['alpha_5fatop_330',['ALPHA_ATOP',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a772a10e83016004a48a40abf5303f396',1,'cv::cuda::ALPHA_ATOP'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a772a10e83016004a48a40abf5303f396',1,'ALPHA_ATOP(Global Namespace)']]], + ['alpha_5fatop_5fpremul_331',['ALPHA_ATOP_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694aa583c173fb8c3c0d97a2b18d7a474d40',1,'cv::cuda::ALPHA_ATOP_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694aa583c173fb8c3c0d97a2b18d7a474d40',1,'ALPHA_ATOP_PREMUL(Global Namespace)']]], + ['alpha_5fin_332',['ALPHA_IN',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a715019460703f11c2ad2fce0f699651d',1,'cv::cuda::ALPHA_IN'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a715019460703f11c2ad2fce0f699651d',1,'ALPHA_IN(Global Namespace)']]], + ['alpha_5fin_5fpremul_333',['ALPHA_IN_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a9c80438eea06fc1e3d1c36dd89afad4a',1,'cv::cuda::ALPHA_IN_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a9c80438eea06fc1e3d1c36dd89afad4a',1,'ALPHA_IN_PREMUL(Global Namespace)']]], + ['alpha_5fout_334',['ALPHA_OUT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a4b058f82e5da6ff6c6fc064b622e939e',1,'cv::cuda::ALPHA_OUT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a4b058f82e5da6ff6c6fc064b622e939e',1,'ALPHA_OUT(Global Namespace)']]], + ['alpha_5fout_5fpremul_335',['ALPHA_OUT_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a5e4b7e0bff18cf3d22484caf1e5a57d2',1,'cv::cuda::ALPHA_OUT_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a5e4b7e0bff18cf3d22484caf1e5a57d2',1,'ALPHA_OUT_PREMUL(Global Namespace)']]], + ['alpha_5fover_336',['ALPHA_OVER',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a5d7ef7ce41890165b48db13c4b07b800',1,'cv::cuda::ALPHA_OVER'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a5d7ef7ce41890165b48db13c4b07b800',1,'ALPHA_OVER(Global Namespace)']]], + ['alpha_5fover_5fpremul_337',['ALPHA_OVER_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a42038364eec729063da1129f91da7ae8',1,'cv::cuda::ALPHA_OVER_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a42038364eec729063da1129f91da7ae8',1,'ALPHA_OVER_PREMUL(Global Namespace)']]], + ['alpha_5fplus_338',['ALPHA_PLUS',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694af8c43ced61d1ac7235d1b0a3e37d8127',1,'cv::cuda::ALPHA_PLUS'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694af8c43ced61d1ac7235d1b0a3e37d8127',1,'ALPHA_PLUS(Global Namespace)']]], + ['alpha_5fplus_5fpremul_339',['ALPHA_PLUS_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a48edec2d9e068d4727c917bbe240c714',1,'cv::cuda::ALPHA_PLUS_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a48edec2d9e068d4727c917bbe240c714',1,'ALPHA_PLUS_PREMUL(Global Namespace)']]], + ['alpha_5fpremul_340',['ALPHA_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a58f446076264b432bd4dbf90eeac74d2',1,'cv::cuda::ALPHA_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a58f446076264b432bd4dbf90eeac74d2',1,'ALPHA_PREMUL(Global Namespace)']]], + ['alpha_5fxor_341',['ALPHA_XOR',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a5f2df452a2f9ecf4153d8f2ff0cdf18b',1,'cv::cuda::ALPHA_XOR'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694a5f2df452a2f9ecf4153d8f2ff0cdf18b',1,'ALPHA_XOR(Global Namespace)']]], + ['alpha_5fxor_5fpremul_342',['ALPHA_XOR_PREMUL',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694afba1dd6df9231630810091dba1ba1c9a',1,'cv::cuda::ALPHA_XOR_PREMUL'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gga320de8db3b0d8624e9b92fc6b117b694afba1dd6df9231630810091dba1ba1c9a',1,'ALPHA_XOR_PREMUL(Global Namespace)']]], + ['alphacomp_343',['alphaComp',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga08a698700458d9311390997b57fbf8dc',1,'cv::cuda::alphaComp()'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga08a698700458d9311390997b57fbf8dc',1,'alphaComp()(Global Namespace)']]], + ['alphacomptypes_344',['AlphaCompTypes',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga320de8db3b0d8624e9b92fc6b117b694',1,'cv::cuda::AlphaCompTypes'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga320de8db3b0d8624e9b92fc6b117b694',1,'AlphaCompTypes(Global Namespace)']]], + ['alphas_345',['alphas',['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#a82b1bc41267f46e5c5899d5b084a73bb',1,'Eigen::GeneralizedEigenSolver']]], + ['alt_346',['ALT',['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#aaee8f2a3f0f04415acca5f1ada1ce8edafd9ab1f5c695ae44e49a8a932431dc61',1,'cv::viz::KeyboardEvent']]], + ['always_5fadjustor_347',['always_adjustor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10699.html',1,'__gnu_cxx::limit_condition::always_adjustor'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10723.html',1,'__gnu_cxx::random_condition::always_adjustor']]], + ['am_5ffilter_348',['AM_FILTER',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50baf5dab3b48abd1fff2316a98a3f1f03b3',1,'cv::ximgproc::AM_FILTER'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50baf5dab3b48abd1fff2316a98a3f1f03b3',1,'AM_FILTER(Global Namespace)']]], + ['amacrincellstemporalcutfrequency_349',['amacrinCellsTemporalCutFrequency',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#ad50ef2a35801eb5e0b2d7ad9e20c33f3',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters']]], + ['ambient_350',['AMBIENT',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acac8a6d0b96e27a89f2b240c0c867a44d7',1,'cv::viz::AMBIENT'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acac8a6d0b96e27a89f2b240c0c867a44d7',1,'AMBIENT(Global Namespace)']]], + ['amdordering_351',['AMDOrdering',['https://eigen.tuxfamily.org/dox/classEigen_1_1AMDOrdering.html',1,'Eigen']]], + ['amethyst_352',['amethyst',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a980cc0325d5b14936fff7abe3c47054f',1,'cv::viz::Color']]], + ['amfilter_353',['amFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaa64a0d71e930e75b2a174e9acc38c37b',1,'cv::ximgproc::amFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaa64a0d71e930e75b2a174e9acc38c37b',1,'amFilter(InputArray joint, InputArray src, OutputArray dst, double sigma_s, double sigma_r, bool adjust_outliers=false)(Global Namespace)']]], + ['an_20image_354',['an Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'Load and Display an Image'],['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'Load, Modify, and Save an Image']]], + ['an_20image_355',['an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'Binary descriptors for lines extracted from an image'],['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'Changing the contrast and brightness of an image!'],['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'Face landmark detection in an image']]], + ['analysis_356',['Analysis',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html',1,'Face Analysis'],['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html',1,'Motion Analysis'],['https://docs.opencv.org/4.2.0/d8/d09/tutorial_model_analysis.html',1,'Training Model Analysis'],['https://docs.opencv.org/4.2.0/d7/de9/group__video.html',1,'Video Analysis'],['https://docs.opencv.org/4.2.0/d3/db0/tutorial_py_table_of_contents_video.html',1,'Video Analysis'],['https://docs.opencv.org/4.2.0/de/db6/tutorial_js_table_of_contents_video.html',1,'Video Analysis']]], + ['analysis_20and_20object_20tracking_357',['Motion Analysis and Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'']]], + ['analysis_20and_20shape_20descriptors_358',['Structural Analysis and Shape Descriptors',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'']]], + ['analysis_20iqa_20api_359',['Image Quality Analysis (IQA) API',['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'']]], + ['analysis_20pca_360',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], + ['analysis_20video_20module_361',['Video analysis (video module)',['https://docs.opencv.org/4.2.0/da/dd0/tutorial_table_of_content_video.html',1,'']]], + ['analytics_20pipeline_20with_20g_20api_362',['Face analytics pipeline with G-API',['https://docs.opencv.org/4.2.0/d8/d24/tutorial_gapi_interactive_face_detection.html',1,'']]], + ['analyze_363',['Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], + ['analyzepattern_364',['analyzePattern',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a5ac967e9f4ccfc43ca9e610b89232c24',1,'Eigen::CholmodBase::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a5ac967e9f4ccfc43ca9e610b89232c24',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a5ac967e9f4ccfc43ca9e610b89232c24',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a5ac967e9f4ccfc43ca9e610b89232c24',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a5ac967e9f4ccfc43ca9e610b89232c24',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a702560ecdddef77dc51d20ab22bd974e',1,'Eigen::IncompleteCholesky::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a3f684fb41019ca04d97ddc08a0d8be2e',1,'Eigen::IterativeSolverBase::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLDLT.html#aab040289e7ba703326c03b11fb084341',1,'Eigen::PastixLDLT::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLLT.html#a00f7fb339fe7a89af66c8307b7078804',1,'Eigen::PastixLLT::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLU.html#a4fc46a120032a448fca3b0be1c4ae5c0',1,'Eigen::PastixLU::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholesky.html#abd631e700699e3abca942ae4a40b1e88',1,'Eigen::SimplicialCholesky::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a6becf242cd792d5c8cb095184e31d699',1,'Eigen::SimplicialLDLT::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a0356f4b58924502dd71ce234ec358567',1,'Eigen::SimplicialLLT::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a9cb0e2b4ad31ec465884b2b2462db6ab',1,'Eigen::SparseLU::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#aa4f0d64bb0ee07ad15ee77c535efb8c4',1,'Eigen::SparseQR::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperILU.html#a52aa43effc247084c91a5e73720a50f6',1,'Eigen::SuperILU::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLU.html#a493cdfada27415a6037b004ff974eace',1,'Eigen::SuperLU::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a2d3f48425328d9b3cbdca369889007f3',1,'Eigen::SuperLUBase::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a2d3f48425328d9b3cbdca369889007f3',1,'SuperLUBase< _MatrixType, SuperILU< _MatrixType > >::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a2d3f48425328d9b3cbdca369889007f3',1,'SuperLUBase< _MatrixType, SuperLU< _MatrixType > >::analyzePattern()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UmfPackLU.html#ac7ea28b2017d6b26b7b08497f294e5e6',1,'Eigen::UmfPackLU::analyzePattern()']]], + ['and_203d_20reconstruction_365',['and 3D Reconstruction',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html',1,'Camera Calibration and 3D Reconstruction'],['https://docs.opencv.org/4.2.0/d9/db7/tutorial_py_table_of_contents_calib3d.html',1,'Camera Calibration and 3D Reconstruction']]], + ['and_203d_20reconstruction_20calib3d_20module_366',['Camera calibration and 3D reconstruction (calib3d module)',['https://docs.opencv.org/4.2.0/d6/d55/tutorial_table_of_content_calib3d.html',1,'']]], + ['and_20algorithms_367',['STL iterators and algorithms',['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'']]], + ['and_20aliasing_368',['Lazy Evaluation and Aliasing',['https://eigen.tuxfamily.org/dox/TopicLazyEvaluation.html',1,'']]], + ['and_20array_20manipulation_369',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], + ['and_20brightness_20of_20an_20image_370',['Changing the contrast and brightness of an image!',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'']]], + ['and_20broadcasting_371',['Reductions, visitors and broadcasting',['https://eigen.tuxfamily.org/dox/group__TutorialReductionsVisitorsBroadcasting.html',1,'']]], + ['and_20camshift_372',['and Camshift',['https://docs.opencv.org/4.2.0/d7/d00/tutorial_meanshift.html',1,'Meanshift and Camshift'],['https://docs.opencv.org/4.2.0/db/df8/tutorial_py_meanshift.html',1,'Meanshift and Camshift'],['https://docs.opencv.org/4.2.0/df/def/tutorial_js_meanshift.html',1,'Meanshift and Camshift']]], + ['and_20channel_20composition_20functions_373',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], + ['and_20charuco_374',['Calibration with ArUco and ChArUco',['https://docs.opencv.org/4.2.0/da/d13/tutorial_aruco_calibration.html',1,'']]], + ['and_20circles_20for_20contours_375',['Creating Bounding boxes and circles for contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'']]], + ['and_20cmake_376',['Using OpenCV with gcc and CMake',['https://docs.opencv.org/4.2.0/db/df5/tutorial_linux_gcc_cmake.html',1,'']]], + ['and_20cmake_20version_203_209_201_377',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['and_20coefficient_20wise_20operations_378',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], + ['and_20composition_20functionality_379',['G-API Drawing and composition functionality',['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'']]], + ['and_20decompositions_380',['and decompositions',['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'Dense linear problems and decompositions'],['https://eigen.tuxfamily.org/dox/group__TutorialLinearAlgebra.html',1,'Linear algebra and decompositions']]], + ['and_20derivated_20tools_381',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], + ['and_20description_382',['and Description',['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/db/d27/tutorial_py_table_of_contents_feature2d.html',1,'Feature Detection and Description']]], + ['and_20dilating_383',['Eroding and Dilating',['https://docs.opencv.org/4.2.0/db/df6/tutorial_erosion_dilatation.html',1,'']]], + ['and_20display_20an_20image_384',['Load and Display an Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'']]], + ['and_20ellipses_20for_20contours_385',['Creating Bounding rotated boxes and ellipses for contours',['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'']]], + ['and_20functions_386',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], + ['and_20images_20matching_387',['Features Finding and Images Matching',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'']]], + ['and_20implementation_20classes_388',['and Implementation Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01501.html',1,'Base and Implementation Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01497.html',1,'Base and Implementation Classes']]], + ['and_20improvement_20techniques_389',['Performance Measurement and Improvement Techniques',['https://docs.opencv.org/4.2.0/dc/d71/tutorial_py_optimization.html',1,'']]], + ['and_20indexing_390',['Slicing and Indexing',['https://eigen.tuxfamily.org/dox/group__TutorialSlicingIndexing.html',1,'']]], + ['and_20information_391',['Initialization and Information',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html',1,'']]], + ['and_20its_20use_20for_20image_20processing_392',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], + ['and_20macros_393',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], + ['and_20matches_394',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], + ['and_20matching_395',['Shape Distance and Matching',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html',1,'']]], + ['and_20media_20highgui_20module_396',['High Level GUI and Media (highgui module)',['https://docs.opencv.org/4.2.0/d0/de2/tutorial_table_of_content_highgui.html',1,'']]], + ['and_20multi_20threading_397',['Eigen and multi-threading',['https://eigen.tuxfamily.org/dox/TopicMultiThreading.html',1,'']]], + ['and_20object_20tracking_398',['Motion Analysis and Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'']]], + ['and_20operations_399',['C structures and operations',['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'']]], + ['and_20orb_20planar_20tracking_400',['AKAZE and ORB planar tracking',['https://docs.opencv.org/4.2.0/dc/d16/tutorial_akaze_tracking.html',1,'']]], + ['and_20other_20classes_401',['Extending MatrixBase (and other classes)',['https://eigen.tuxfamily.org/dox/TopicCustomizing_Plugins.html',1,'']]], + ['and_20other_20intel_20perceptual_20computing_20sdk_20compatible_20depth_20sensors_402',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], + ['and_20other_20openni_20compatible_20depth_20sensors_403',['Using Kinect and other OpenNI compatible depth sensors',['https://docs.opencv.org/4.2.0/d7/d6f/tutorial_kinect_openni.html',1,'']]], + ['and_20output_20imgcodecs_20module_404',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], + ['and_20output_20using_20xml_20and_20yaml_20files_405',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], + ['and_20output_20videoio_20module_406',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], + ['and_20policy_20classes_407',['and Policy Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01531.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01535.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01529.html',1,'Base and Policy Classes']]], + ['and_20pose_20estimation_408',['CNN for 3D Object Classification and Pose Estimation',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'']]], + ['and_20pose_20estimation_20api_409',['3D object recognition and pose estimation API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'']]], + ['and_20reading_20datasets_410',['Creating, Writing and Reading Datasets',['https://docs.opencv.org/4.2.0/d4/d93/tutorial_hdf_create_read_write_datasets.html',1,'']]], + ['and_20real_20world_20vision_411',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], + ['and_20recognition_412',['Scene Text Detection and Recognition',['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'']]], + ['and_20rotated_20brief_413',['ORB (Oriented FAST and Rotated BRIEF)',['https://docs.opencv.org/4.2.0/d1/d89/tutorial_py_orb.html',1,'']]], + ['and_20save_20an_20image_414',['Load, Modify, and Save an Image',['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'']]], + ['and_20search_20in_20multi_20dimensional_20spaces_415',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], + ['and_20shape_20descriptors_416',['Structural Analysis and Shape Descriptors',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'']]], + ['and_20similarity_20measurement_417',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], + ['and_20ssim_20on_20the_20gpu_418',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], + ['and_20subtract_419',['Element-wise add and subtract',['https://docs.opencv.org/4.2.0/d8/d6f/group__core__hal__interface__addsub.html',1,'']]], + ['and_20system_20functions_20and_20macros_420',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], + ['and_20text_20with_20opencv_421',['Random generator and text with OpenCV',['https://docs.opencv.org/4.2.0/df/d61/tutorial_random_generator_and_text.html',1,'']]], + ['and_20time_20measurement_20with_20opencv_422',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], + ['and_20tutorials_423',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], + ['and_20typename_20keywords_20in_20c_424',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], + ['and_20vector_20arithmetic_425',['Matrix and vector arithmetic',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixArithmetic.html',1,'']]], + ['and_20vertical_20lines_20by_20using_20morphological_20operations_426',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], + ['and_20watershed_20algorithm_427',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], + ['and_20writing_428',['Image file reading and writing',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html',1,'']]], + ['and_20writing_20attributes_429',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]], + ['and_20yaml_20files_430',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], + ['and8u_431',['and8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga1a479a26d137b754fbc2b1741a7ac896',1,'cv::hal::and8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga1a479a26d137b754fbc2b1741a7ac896',1,'and8u(const uchar *src1, size_t step1, const uchar *src2, size_t step2, uchar *dst, size_t step, int width, int height, void *)(Global Namespace)']]], + ['android_20camera_20preview_20based_20cv_20application_432',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], + ['android_20development_433',['Introduction into Android Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'']]], + ['android_20development_20with_20opencv_434',['Android Development with OpenCV',['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'']]], + ['android_20device_435',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], + ['android_5fdev_5fintro_2emarkdown_436',['android_dev_intro.markdown',['https://docs.opencv.org/4.2.0/d1/dc0/android__dev__intro_8markdown.html',1,'']]], + ['android_5focl_5fintro_2emarkdown_437',['android_ocl_intro.markdown',['https://docs.opencv.org/4.2.0/d1/dd0/android__ocl__intro_8markdown.html',1,'']]], + ['ang_5fth_438',['ang_th',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#a7151b3d4884a15d9a55962017dcf8b1b',1,'cv::line_descriptor::LSDParam']]], + ['angle_439',['angle',['https://docs.opencv.org/4.2.0/d9/daa/structcvhalKeyPoint.html#a1fda20d16c9d38251b1224047001782d',1,'cvhalKeyPoint::angle'],['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a041a6bbf2fc22e3ab9f5a80ef5a5b922',1,'cv::line_descriptor::KeyLine::angle'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#a4484e94502486930e94e7391adf9d215',1,'cv::KeyPoint::angle'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a40a8833052852341dffc442d7001421b',1,'cv::ppf_match_3d::Pose3D::angle'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a6bd95a46f9ab83a4f384a4d4845e6332',1,'cv::RotatedRect::angle'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a5bcd8f21aa18b629e2b5c64d03caeb96',1,'Eigen::AngleAxis::angle()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a5c9671c47a3b26c2b585042f42426d7e',1,'Eigen::AngleAxis::angle() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ab3cde04b655d42682d1f79952f8ef2f8',1,'Eigen::Rotation2D::angle()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ab1296dc7fcb23fdcd2c8e648e87d5d6a',1,'Eigen::Rotation2D::angle() const']]], + ['angle_5frow_440',['ANGLE_ROW',['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#a601e66398b65495a3712b7486c23eb43',1,'cv::cuda::ORB::ANGLE_ROW'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a3b5156553e52661b04bf02fa9628f746ab6931becd145cd66fbd03c80896cb3de',1,'cv::cuda::SURF_CUDA::ANGLE_ROW']]], + ['angle_5fstep_441',['angle_step',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#af9e47c5d420dfe5f53eb6a615222d9ca',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['angle_5fstep_5fradians_442',['angle_step_radians',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#aac17f71a9392d3152a57b5c59ec29b2c',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['angle_5fstep_5frelative_443',['angle_step_relative',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#ad5329f040b31639cb47c32fd7bdd5cb7',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['angleaxis_444',['AngleAxis',['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html',1,'Eigen::AngleAxis< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a08752eea5e7762f2585fbd8136dc7b4b',1,'Eigen::AngleAxis::AngleAxis()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a7c6bdf26fc162c6423d7cff097a9a00e',1,'Eigen::AngleAxis::AngleAxis(const AngleAxis< OtherScalarType > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a2e6eee34f611e4c762fdd4e4bc5935e6',1,'Eigen::AngleAxis::AngleAxis(const MatrixBase< Derived > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#af3476809863b6a0dfe17f49a3dcc6530',1,'Eigen::AngleAxis::AngleAxis(const QuaternionBase< QuatDerived > &q)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#ab58bae23f0af86d66d8aa1dc5c1dbe39',1,'Eigen::AngleAxis::AngleAxis(const Scalar &angle, const MatrixBase< Derived > &axis)']]], + ['angleaxisd_445',['AngleAxisd',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaed936d6e9192d97f00a9608081fa9b64',1,'Eigen::AngleAxisd'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gaed936d6e9192d97f00a9608081fa9b64',1,'AngleAxisd(Global Namespace)']]], + ['angleaxisf_446',['AngleAxisf',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gad823b9c674644b14d950fbfe165dfdbf',1,'Eigen::AngleAxisf'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gad823b9c674644b14d950fbfe165dfdbf',1,'AngleAxisf(Global Namespace)']]], + ['angleaxistype_447',['AngleAxisType',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aed266c63b10a4028304901d9c8614199',1,'Eigen::QuaternionBase::AngleAxisType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aed266c63b10a4028304901d9c8614199',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::AngleAxisType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aed266c63b10a4028304901d9c8614199',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::AngleAxisType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aed266c63b10a4028304901d9c8614199',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::AngleAxisType']]], + ['anglerangeoption_448',['AngleRangeOption',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3e',1,'cv::ximgproc']]], + ['anglethreshold_449',['angleThreshold',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a1bc93cb13d3a07ec8901b070aa726f8f',1,'cv::rgbd::FastICPOdometry']]], + ['angulardistance_450',['angularDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a74f13d7c853484996494c26c633ae02a',1,'Eigen::QuaternionBase::angularDistance()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a74f13d7c853484996494c26c633ae02a',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::angularDistance()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a74f13d7c853484996494c26c633ae02a',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::angularDistance()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a74f13d7c853484996494c26c633ae02a',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::angularDistance()']]], + ['anisotropic_20image_20segmentation_20by_20a_20gradient_20structure_20tensor_451',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], + ['anisotropic_20image_20segmentation_20on_20g_20api_452',['Porting anisotropic image segmentation on G-API',['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'']]], + ['anisotropic_5fimage_5fsegmentation_2emarkdown_453',['anisotropic_image_segmentation.markdown',['https://docs.opencv.org/4.2.0/d8/d5f/anisotropic__image__segmentation_8markdown.html',1,'']]], + ['anisotropicdiffusion_454',['anisotropicDiffusion',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#gaffedd976e0a8efb5938107acab185ec2',1,'cv::ximgproc::anisotropicDiffusion()'],['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html#gaffedd976e0a8efb5938107acab185ec2',1,'anisotropicDiffusion()(Global Namespace)']]], + ['ann_5fmlp_455',['ANN_MLP',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html',1,'cv::ml']]], + ['ann_5fmlp_5fanneal_456',['ANN_MLP_ANNEAL',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ga41d135383c258bd312a54a7964a6e7c3',1,'cv::ml::ANN_MLP_ANNEAL'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ga41d135383c258bd312a54a7964a6e7c3',1,'ANN_MLP_ANNEAL(Global Namespace)']]], + ['anneal_457',['ANNEAL',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a012b34ee340b5d4d11b6844e12816181a1c1f898fdf7406d1f114ddfd8e06ae4e',1,'cv::ml::ANN_MLP']]], + ['annotate_5fbase_458',['annotate_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10679.html',1,'__gnu_cxx']]], + ['another_459',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], + ['any_460',['any',['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html',1,'cv::util::any'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html',1,'std::experimental::fundamentals_v1::any'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01007.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#ae19f50e18243258f74bb699a5bd0bf51',1,'cv::util::any::any(value_t &&arg)'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#aeba873daa7708d06ce97c8350b87a906',1,'cv::util::any::any(any const &src)'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a1b5428abca0acb621ef6f3efc28d0ed1',1,'cv::util::any::any(any &src)'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a4e6dcc8c6ab0241a5e38161d0b84910a',1,'cv::util::any::any()=default'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a2ed210725661401aa53c0bf76f91a263',1,'cv::util::any::any(any &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac04f8abc0698b5d65081d1253d68aca9',1,'std::bitset::any()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a6ba2922445d4e290bfc4e2437c61417b',1,'std::experimental::fundamentals_v1::any::any() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a17c5dbe5004a59d142907072bffe439c',1,'std::experimental::fundamentals_v1::any::any(const any &__other)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a347ce9a01a1c622c06338b2725dcba31',1,'std::experimental::fundamentals_v1::any::any(any &&__other) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#acd927b924b7895c43b139485ad2b2e31',1,'std::experimental::fundamentals_v1::any::any(_ValueType &&__value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#acd927b924b7895c43b139485ad2b2e31',1,'std::experimental::fundamentals_v1::any::any(_ValueType &&__value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ac7d91a54176095fd09f6082d2933590c',1,'std::tr2::dynamic_bitset::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#abfbf4cb72dd577e62fbe035b1c53e695',1,'Eigen::DenseBase::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#abfbf4cb72dd577e62fbe035b1c53e695',1,'DenseBase< ArrayWrapper< ExpressionType > >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#abfbf4cb72dd577e62fbe035b1c53e695',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#abfbf4cb72dd577e62fbe035b1c53e695',1,'DenseBase< Solve< Decomposition, RhsType > >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'Eigen::VectorwiseOp::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const Derived, Horizontal >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const Derived, Vertical >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::any()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a96210c9f83bd375f8ce862bd62ab70e6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::any()']]], + ['any_20type_461',['Type-safe container of any type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html',1,'']]], + ['any_2eh_462',['any.h',['https://docs.opencv.org/4.2.0/df/d8d/any_8h.html',1,'']]], + ['any_2ehpp_463',['any.hpp',['https://docs.opencv.org/4.2.0/d2/d62/any_8hpp.html',1,'']]], + ['any_5fcast_464',['any_cast',['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#ae7ef1dbc0cdc39ec050a9c98622bd25d',1,'cv::util::any::any_cast'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a766e0179482d6c484ce23889d4bebcc9',1,'cv::util::any::any_cast'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a3241d508b69fbd3fda35e2c297329b09',1,'cv::util::any_cast(any *operand)'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#ae14333b7e35289b31d2ba7cc998df881',1,'cv::util::any_cast(const any *operand)'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#acde17b4fdf07e20074b6314b6b9704c5',1,'cv::util::any_cast(any &operand)'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a68860eb2eecf2ff73e997b4475ce3bd3',1,'cv::util::any_cast(const any &operand)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#ga3804b3e41a5ff0dae8d32c2cf453995f',1,'any_cast(const any &__any)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#ga07b480a27e1afe811ba7f9a00b872b02',1,'any_cast(any &__any)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#ga1caa36240a2b94c244dbe57273c0be2d',1,'any_cast(any &&__any)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#gad86d82adff5b2c8d613f2f248729aa02',1,'any_cast(const any *__any) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#ga30e7b55472db9e7d44060e5db2c2f255',1,'any_cast(any *__any) noexcept(Global Namespace)']]], + ['any_5fof_465',['any_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaa8fada47994395ec51bb54536d6a87f9',1,'std::any_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaa8fada47994395ec51bb54536d6a87f9',1,'any_of(_InputIterator __first, _InputIterator __last, _Predicate __pred)(Global Namespace)']]], + ['api_466',['API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'3D object recognition and pose estimation API'],['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'Adding a new algorithm to the Facemark API'],['https://docs.opencv.org/4.2.0/d0/d71/classcv_1_1detail_1_1GCompoundKernelImpl.html#a0118297d188a70c35b4071109d9921ca',1,'cv::detail::GCompoundKernelImpl::API'],['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1GCPUKernelImpl.html#aa5bdd54f0550151b76dfa896dacaf347',1,'cv::GCPUKernelImpl::API'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1GFluidKernelImpl.html#ad9654fa0fdd7323acf55e4b69c6000f4',1,'cv::GFluidKernelImpl::API'],['https://docs.opencv.org/4.2.0/dc/de8/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a8deb9cb3b86d9ff737551479d58223a1',1,'cv::GNetworkType< K, std::function< R(Args...)> >::API'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a250c7a499bcf263c64413b6a82addb00',1,'cv::GNetworkType< K, std::function< std::tuple< R... >(Args...)> >::API'],['https://docs.opencv.org/4.2.0/d0/d0d/classcv_1_1GOCLKernelImpl.html#a89c12b602953b44d6488fb60efbff2b6',1,'cv::GOCLKernelImpl::API'],['https://docs.opencv.org/4.2.0/d1/d8a/classcv_1_1GPlaidMLKernelImpl.html#a849b26d7b5f1f0c8f1e6e7d6a75c60c7',1,'cv::GPlaidMLKernelImpl::API'],['https://docs.opencv.org/4.2.0/db/d1f/classcv_1_1GTransformImpl_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a9c44d6f37621f1442c9ead63a30fb67f',1,'cv::GTransformImpl< K, std::function< R(Args...)> >::API'],['https://docs.opencv.org/4.2.0/da/d57/group__core__async.html',1,'Asynchronous API'],['https://docs.opencv.org/4.2.0/df/d4e/group__imgproc__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/da/d0a/group__imgcodecs__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d0/d28/group__highgui__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d3/d12/group__video__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d5/db8/group__calib3d__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d9/d31/group__objdetect__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d3/d40/group__photo__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d8/d24/tutorial_gapi_interactive_face_detection.html',1,'Face analytics pipeline with G-API'],['https://docs.opencv.org/4.2.0/d0/d1e/gapi.html',1,'Graph API'],['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'Image Quality Analysis (IQA) API'],['https://docs.opencv.org/4.2.0/d4/d48/tutorial_gapi_face_beautification.html',1,'Implementing a face beautification algorithm with G-API'],['https://docs.opencv.org/4.2.0/d0/d25/gapi_kernel_api.html',1,'Kernel API'],['https://docs.opencv.org/4.2.0/df/d3a/group__phase__unwrapping.html',1,'Phase Unwrapping API'],['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'Porting anisotropic image segmentation on G-API'],['https://docs.opencv.org/4.2.0/d8/d65/group__saliency.html',1,'Saliency API'],['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html',1,'Structured Light API'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html',1,'Tracking API'],['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'Tutorial on Facial Landmark Detector API'],['https://docs.opencv.org/4.2.0/d7/dec/tutorial_facemark_usage.html',1,'Using the Facemark API'],['https://docs.opencv.org/4.2.0/d6/dc9/gapi_purposes.html',1,'Why Graph API?']]], + ['api_20backends_467',['Additional flags for video I/O API backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'']]], + ['api_20backends_20registry_468',['Query I/O API backends registry',['https://docs.opencv.org/4.2.0/de/db1/group__videoio__registry.html',1,'']]], + ['api_20core_20functionality_469',['G-API Core functionality',['https://docs.opencv.org/4.2.0/df/d1f/group__gapi__core.html',1,'']]], + ['api_20data_20types_470',['G-API Data Types',['https://docs.opencv.org/4.2.0/db/df1/group__gapi__data__objects.html',1,'']]], + ['api_20drawing_20and_20composition_20functionality_471',['G-API Drawing and composition functionality',['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'']]], + ['api_20for_20external_20libraries_20plugins_472',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], + ['api_20for_20video_20i_20o_473',['C API for video I/O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__c.html',1,'']]], + ['api_20framework_474',['G-API framework',['https://docs.opencv.org/4.2.0/d7/d0d/group__gapi.html',1,'']]], + ['api_20gapi_20module_475',['Graph API (gapi module)',['https://docs.opencv.org/4.2.0/df/d7e/tutorial_table_of_content_gapi.html',1,'']]], + ['api_20graph_20compilation_20arguments_476',['G-API Graph Compilation Arguments',['https://docs.opencv.org/4.2.0/d9/d29/group__gapi__compile__args.html',1,'']]], + ['api_20image_20processing_20functionality_477',['G-API Image processing functionality',['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'']]], + ['api_20main_20classes_478',['G-API Main Classes',['https://docs.opencv.org/4.2.0/d8/dd0/group__gapi__main__classes.html',1,'']]], + ['api_20metadata_20descriptors_479',['G-API Metadata Descriptors',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html',1,'']]], + ['api_20opencl_20cl_20va_20interoperability_480',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], + ['api_20overview_481',['G-API Overview',['https://docs.opencv.org/4.2.0/db/d87/md_gapi_doc_slides_README.html',1,'']]], + ['api_20standard_20backends_482',['G-API Standard Backends',['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html',1,'']]], + ['api_20stitcher_20class_483',['High level stitching API (Stitcher class)',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'']]], + ['api_3a_20converting_20image_20from_20one_20color_20space_20to_20another_484',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], + ['api_3a_20image_20and_20channel_20composition_20functions_485',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], + ['api_3a_20image_20filters_486',['Graph API: Image filters',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html',1,'']]], + ['api_3a_20math_20operations_487',['Graph API: Math operations',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html',1,'']]], + ['api_3a_20operations_20on_20matrices_488',['Graph API: Operations on matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'']]], + ['api_3a_20pixelwise_20operations_489',['Graph API: Pixelwise operations',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html',1,'']]], + ['api_5fdescription_490',['api_description',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#a126f169513031bd754899ff3f9b4a3bd',1,'OpenCV_API_Header']]], + ['api_5fversion_491',['api_version',['https://docs.opencv.org/4.2.0/d3/dde/structOpenCV__API__Header.html#a40d9cc3d5864f0d2a99e306228a37cdc',1,'OpenCV_API_Header']]], + ['apilist_492',['APIList',['https://docs.opencv.org/4.2.0/dc/de8/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#a4eb2af7049d77384e99d857c7aeea95f',1,'cv::GNetworkType< K, std::function< R(Args...)> >::APIList'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1GNetworkType_3_01K_00_01std_1_1function_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4_01_4.html#a916f57342e4279138f2978779ead6497',1,'cv::GNetworkType< K, std::function< std::tuple< R... >(Args...)> >::APIList']]], + ['app_493',['app',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'basic_ios< char, _Traits >::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'basic_iostream< char >::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'basic_istream< char >::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'basic_istream< char, _Traits >::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'basic_ostream< char >::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'basic_ostream< char, _Traits >::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_fstream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_ifstream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_ios::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_iostream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_istream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_istringstream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_ofstream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_ostream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_ostringstream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::basic_stringstream::app'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#abc6732e5a0d9dc40b79e2fe6e32e7b09',1,'std::ios_base::app']]], + ['append_494',['APPEND',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da049591e6d1749b29bb206909c70b2470',1,'cv::FileStorage']]], + ['append_495',['append',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a951ff9afc9f61474a79b0233ff010289',1,'__gnu_cxx::__versa_string::append(const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae5b284367d022a51a33e4118e25866bb',1,'__gnu_cxx::__versa_string::append(const __versa_string &__str, size_type __pos, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aea54d824534ee9f125a58ec9033cdd48',1,'__gnu_cxx::__versa_string::append(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae6d34116930903e7bc8354fe92ef8593',1,'__gnu_cxx::__versa_string::append(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a3fb56cb34ced33afd4b5c53b30c10a46',1,'__gnu_cxx::__versa_string::append(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a4f19cd669d7f21d93f5fb36ba8384e65',1,'__gnu_cxx::__versa_string::append(std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9f84dceb2e21c9e61ca067d54c2957ad',1,'__gnu_cxx::__versa_string::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'__gnu_debug::basic_string::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'__gnu_debug::basic_string::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'__gnu_debug::basic_string::append(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< _CharT >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< _CharT >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< _CharT >::append(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< _CharT >::append(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< _CharT >::append(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< _CharT >::append(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< _CharT >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< _CharT, _Traits, _Allocator >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< _CharT, _Traits, _Allocator >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< _CharT, _Traits, _Allocator >::append(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< _CharT, _Traits, _Allocator >::append(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< _CharT, _Traits, _Allocator >::append(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< _CharT, _Traits, _Allocator >::append(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< _CharT, _Traits, _Allocator >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(const _Elem *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(size_type __n, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< char >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< char >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< char >::append(const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< char >::append(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< char >::append(size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< char >::append(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< char >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< char, char_traits< char >, _Byte_alloc >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< char_type, _Traits, _Alloc >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< char_type, _Traits, _Alloc >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< char_type, _Traits, _Alloc >::append(const char_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< char_type, _Traits, _Alloc >::append(const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< char_type, _Traits, _Alloc >::append(size_type __n, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< char_type, _Traits, _Alloc >::append(initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< char_type, _Traits, _Alloc >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'basic_string< value_type >::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'basic_string< value_type >::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'basic_string< value_type >::append(const value_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'basic_string< value_type >::append(const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'basic_string< value_type >::append(size_type __n, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'basic_string< value_type >::append(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'basic_string< value_type >::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a93795d6e4ab56974a69099a52726c1e1',1,'std::basic_string::append(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a07de98e080c12d6a757368e040baaa6d',1,'std::basic_string::append(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aedb1f587c0c2da80a654e467e0b02103',1,'std::basic_string::append(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af7fa2c8af0d7a45bb3e3cfe0fd8ae6f8',1,'std::basic_string::append(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a41e22e66a2acd2c64d15cabdc9d3820d',1,'std::basic_string::append(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abbc4bbfee03cbca12a25929455036337',1,'std::basic_string::append(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1279610b99283848863401984efae5c2',1,'std::basic_string::append(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a15d3fb346ccfcba83148dcc3dbcfe41f',1,'std::tr2::dynamic_bitset::append(block_type __block)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab096eed28395ba93a82038788496953e',1,'std::tr2::dynamic_bitset::append(_BlockInputIterator __first, _BlockInputIterator __last)']]], + ['appendpose_496',['appendPose',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a4aaae88410db92cad52250668e24b5c6',1,'cv::ppf_match_3d::Pose3D']]], + ['application_497',['Add a Trackbar to Your Application',['https://docs.opencv.org/4.2.0/d5/df3/tutorial_js_trackbar.html',1,'']]], + ['application_498',['application',['https://docs.opencv.org/4.2.0/d7/d21/tutorial_interactive_calibration.html',1,'Interactive camera calibration application'],['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'Use OpenCL in Android camera preview based CV application']]], + ['applications_499',['applications',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'Adding a Trackbar to our applications!'],['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'Interactive Visual Debugging of Computer Vision applications']]], + ['applications_20with_20opencv_20inside_20the_20microsoft_20visual_20studio_500',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['apply_501',['apply',['https://docs.opencv.org/4.2.0/d7/df6/classcv_1_1BackgroundSubtractor.html#aa735e76f7069b3fa9c3f32395f9ccd21',1,'cv::BackgroundSubtractor::apply()'],['https://docs.opencv.org/4.2.0/de/dca/classcv_1_1bgsegm_1_1BackgroundSubtractorCNT.html#a2b5caeaf02d92a97395d68df0c93b4a8',1,'cv::bgsegm::BackgroundSubtractorCNT::apply()'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html#a9bfd022be3fb7696e7a16ba2a49d201f',1,'cv::cuda::BackgroundSubtractorGMG::apply()'],['https://docs.opencv.org/4.2.0/d4/dd5/classcv_1_1bgsegm_1_1BackgroundSubtractorGSOC.html#ae175a4304d2d0f025398858592e8d73b',1,'cv::bgsegm::BackgroundSubtractorGSOC::apply()'],['https://docs.opencv.org/4.2.0/de/d4c/classcv_1_1bgsegm_1_1BackgroundSubtractorLSBP.html#a9cc2c37d5d5ebe7e5ff0709d5adc1269',1,'cv::bgsegm::BackgroundSubtractorLSBP::apply()'],['https://docs.opencv.org/4.2.0/d1/dfe/classcv_1_1cuda_1_1BackgroundSubtractorMOG.html#a8f52d2f7abd1c77c84243efc53972cbf',1,'cv::cuda::BackgroundSubtractorMOG::apply()'],['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html#a682adde901148d85450435e6cc0de4a1',1,'cv::BackgroundSubtractorMOG2::apply()'],['https://docs.opencv.org/4.2.0/df/d23/classcv_1_1cuda_1_1BackgroundSubtractorMOG2.html#a92408f07bf1268c1b778cb186b3113b0',1,'cv::cuda::BackgroundSubtractorMOG2::apply()'],['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a7d9f7cc4906521e2e94477472b96a8d6',1,'cv::detail::BlocksCompensator::apply()'],['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html#acae1be1bd0051e970ec02764a522e325',1,'cv::detail::BlocksGainCompensator::apply()'],['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html#ab45c3aa811a6d380cc77a86dbb87520a',1,'cv::detail::ChannelsCompensator::apply()'],['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1CLAHE.html#a4e92e0e427de21be8d1fae8dcd862c5e',1,'cv::CLAHE::apply()'],['https://docs.opencv.org/4.2.0/db/d79/classcv_1_1cuda_1_1CLAHE.html#a60d2b58f7cb010aab249feee3305d106',1,'cv::cuda::CLAHE::apply()'],['https://docs.opencv.org/4.2.0/d5/d57/structcv_1_1hal_1_1DCT2D.html#a65e394512aa7960c2a417664bc9eb88a',1,'cv::hal::DCT2D::apply()'],['https://docs.opencv.org/4.2.0/d8/d03/structcv_1_1hal_1_1DFT1D.html#a0417fccdd79e564bf77dee93fcbb2bba',1,'cv::hal::DFT1D::apply()'],['https://docs.opencv.org/4.2.0/d6/d77/structcv_1_1hal_1_1DFT2D.html#a63f9dcbe4f9a89185087b399270de94b',1,'cv::hal::DFT2D::apply()'],['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html#a2e2d2eb668d213a402c68044ac2b0aba',1,'cv::cuda::DisparityBilateralFilter::apply()'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#a473eaf1e585804c08d77c91e004f93aa',1,'cv::detail::ExposureCompensator::apply()'],['https://docs.opencv.org/4.2.0/dc/d2b/classcv_1_1cuda_1_1Filter.html#a20b58d13871027473b4c39cc698cf80f',1,'cv::cuda::Filter::apply()'],['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#a46c3121e915fd439f88bbbe3a54b18ef',1,'cv::detail::GainCompensator::apply()'],['https://docs.opencv.org/4.2.0/df/d95/classcv_1_1detail_1_1GCompoundKernel.html#aed2335850dcab6603305c09ba05f79e2',1,'cv::detail::GCompoundKernel::apply()'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#aa25bc73f7cba9bb2f9992edaa248f868',1,'cv::GComputation::apply(GRunArgs &&ins, GRunArgsP &&outs, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#aafd7a4d5103eafc398ebd15564ee059e',1,'cv::GComputation::apply(cv::Mat in, cv::Mat &out, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a12fd86d3cc5140df37d6a8aa0a0f7230',1,'cv::GComputation::apply(cv::Mat in, cv::Scalar &out, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#ad35660e432c5ec676fe2830eb8a9651b',1,'cv::GComputation::apply(cv::Mat in1, cv::Mat in2, cv::Mat &out, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a4eb4b830d5cdf6891470a3b111b0e619',1,'cv::GComputation::apply(cv::Mat in1, cv::Mat in2, cv::Scalar &out, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#acacdf438026f43ec0db3d84e5b02d340',1,'cv::GComputation::apply(const std::vector< cv::Mat > &ins, std::vector< cv::Mat > &outs, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/dd/d0d/classcv_1_1GComputationT_3_01R_07Args_8_8_8_08_4.html#a0065e2b7c54a83b55c8d55607441ee5d',1,'cv::GComputationT< R(Args...)>::apply()'],['https://docs.opencv.org/4.2.0/dd/d97/classcv_1_1GComputationT_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4.html#a2de3a070b1580db7f82df16ddab63b2c',1,'cv::GComputationT< std::tuple< R... >(Args...)>::apply()'],['https://docs.opencv.org/4.2.0/df/d27/classcv_1_1GCPUKernel.html#a50f75ca947cfbe574a41e61d1a6ce5f3',1,'cv::GCPUKernel::apply()'],['https://docs.opencv.org/4.2.0/d5/d65/classcv_1_1GOCLKernel.html#a4c2736a75bb29feb1ddd387947135393',1,'cv::GOCLKernel::apply()'],['https://docs.opencv.org/4.2.0/df/db7/classcv_1_1GPlaidMLKernel.html#aa6ad01b741587b0e02668dfb4bca8c59',1,'cv::GPlaidMLKernel::apply()'],['https://docs.opencv.org/4.2.0/d2/dc1/classcv_1_1detail_1_1NoExposureCompensator.html#a85ba499493a5793474d2801e8c249c06',1,'cv::detail::NoExposureCompensator::apply()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6187e472096936d517db9cd9851fc107',1,'std::valarray::apply(_Tp func(_Tp)) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4fc494f4aee2efb200793044d68658c5',1,'std::valarray::apply(_Tp func(const _Tp &)) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6187e472096936d517db9cd9851fc107',1,'valarray< size_t >::apply(size_t func(size_t)) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4fc494f4aee2efb200793044d68658c5',1,'valarray< size_t >::apply(size_t func(const size_t &)) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6187e472096936d517db9cd9851fc107',1,'apply(_Tp func(_Tp)) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4fc494f4aee2efb200793044d68658c5',1,'apply(_Tp func(const _Tp &)) const(Global Namespace)']]], + ['apply_5fgenerator_502',['apply_generator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01599.html#a901aed464640d1d4b48ea99ef8456964',1,'__gnu_cxx::typelist']]], + ['applychannelgains_503',['applyChannelGains',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga95fba1ce3eb262ed1b5dbb4385f8b590',1,'cv::xphoto::applyChannelGains()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga95fba1ce3eb262ed1b5dbb4385f8b590',1,'applyChannelGains()(Global Namespace)']]], + ['applycolormap_504',['applyColorMap',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gadf478a5e5ff49d8aa24e726ea6f65d15',1,'cv::applyColorMap(InputArray src, OutputArray dst, int colormap)'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gacb22288ddccc55f9bd9e6d492b409cae',1,'cv::applyColorMap(InputArray src, OutputArray dst, InputArray userColor)'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gadf478a5e5ff49d8aa24e726ea6f65d15',1,'applyColorMap(InputArray src, OutputArray dst, int colormap)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gacb22288ddccc55f9bd9e6d492b409cae',1,'applyColorMap(InputArray src, OutputArray dst, InputArray userColor)(Global Namespace)']]], + ['applyfasttonemapping_505',['applyFastToneMapping',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a1bb2ed3bee0ced414ed0533fba641dec',1,'cv::bioinspired::Retina::applyFastToneMapping()'],['https://docs.opencv.org/4.2.0/dd/d73/classcv_1_1bioinspired_1_1RetinaFastToneMapping.html#ad84c0513227ddaa3fb0c23cc37cc4f3a',1,'cv::bioinspired::RetinaFastToneMapping::applyFastToneMapping()']]], + ['applyhalidescheduler_506',['applyHalideScheduler',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a8af8ddbbb682edf69f1abd78ea25c79b',1,'cv::dnn::Layer']]], + ['applyhouseholderontheleft_507',['applyHouseholderOnTheLeft',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8f2c8059ef3f04cfa0c73b4c012db855',1,'Eigen::MatrixBase::applyHouseholderOnTheLeft()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8f2c8059ef3f04cfa0c73b4c012db855',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::applyHouseholderOnTheLeft()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8f2c8059ef3f04cfa0c73b4c012db855',1,'MatrixBase< Solve< Decomposition, RhsType > >::applyHouseholderOnTheLeft()']]], + ['applyhouseholderontheright_508',['applyHouseholderOnTheRight',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab3e52262b41fa40e194dda245e0f9675',1,'Eigen::MatrixBase::applyHouseholderOnTheRight()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab3e52262b41fa40e194dda245e0f9675',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::applyHouseholderOnTheRight()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab3e52262b41fa40e194dda245e0f9675',1,'MatrixBase< Solve< Decomposition, RhsType > >::applyHouseholderOnTheRight()']]], + ['applyontheleft_509',['applyOnTheLeft',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3a08ad41e81d8ad4a37b5d5c7490e765',1,'Eigen::MatrixBase::applyOnTheLeft(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae669131f6e18f7e8f06fae271754f435',1,'Eigen::MatrixBase::applyOnTheLeft(Index p, Index q, const JacobiRotation< OtherScalar > &j)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3a08ad41e81d8ad4a37b5d5c7490e765',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::applyOnTheLeft(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae669131f6e18f7e8f06fae271754f435',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::applyOnTheLeft(Index p, Index q, const JacobiRotation< OtherScalar > &j)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3a08ad41e81d8ad4a37b5d5c7490e765',1,'MatrixBase< Solve< Decomposition, RhsType > >::applyOnTheLeft(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae669131f6e18f7e8f06fae271754f435',1,'MatrixBase< Solve< Decomposition, RhsType > >::applyOnTheLeft(Index p, Index q, const JacobiRotation< OtherScalar > &j)']]], + ['applyontheright_510',['applyOnTheRight',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a45d91752925d2757fc8058a293b15462',1,'Eigen::MatrixBase::applyOnTheRight(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/group__Jacobi__Module.html#gaa07f741c86219601664433777827bf1c',1,'Eigen::MatrixBase::applyOnTheRight(Index p, Index q, const JacobiRotation< OtherScalar > &j)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a45d91752925d2757fc8058a293b15462',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::applyOnTheRight(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/group__Jacobi__Module.html#gaa07f741c86219601664433777827bf1c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::applyOnTheRight(Index p, Index q, const JacobiRotation< OtherScalar > &j)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a45d91752925d2757fc8058a293b15462',1,'MatrixBase< Solve< Decomposition, RhsType > >::applyOnTheRight(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/group__Jacobi__Module.html#gaa07f741c86219601664433777827bf1c',1,'MatrixBase< Solve< Decomposition, RhsType > >::applyOnTheRight(Index p, Index q, const JacobiRotation< OtherScalar > &j)'],['https://eigen.tuxfamily.org/dox/group__Jacobi__Module.html#gaa07f741c86219601664433777827bf1c',1,'applyOnTheRight()(Global Namespace)']]], + ['applytransform_511',['applyTransform',['https://docs.opencv.org/4.2.0/d9/d26/classcv_1_1viz_1_1Widget3D.html#a45a01c3f9e91367c7de5832bc8e60d0d',1,'cv::viz::Widget3D']]], + ['applytransformation_512',['applyTransformation',['https://docs.opencv.org/4.2.0/df/dfe/classcv_1_1ShapeTransformer.html#a30227d0a64fb1747a90ed7efa1519cef',1,'cv::ShapeTransformer']]], + ['applytransformationtopoints_513',['applyTransformationToPoints',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga7b77333794ddab27da390b19baa033b2',1,'cv::sfm::applyTransformationToPoints()'],['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga7b77333794ddab27da390b19baa033b2',1,'applyTransformationToPoints()(Global Namespace)']]], + ['applytranspositionontheleft_514',['applyTranspositionOnTheLeft',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a4e3455bf12b56123e38a8220c6b508dc',1,'Eigen::PermutationBase::applyTranspositionOnTheLeft()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a4e3455bf12b56123e38a8220c6b508dc',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::applyTranspositionOnTheLeft()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a4e3455bf12b56123e38a8220c6b508dc',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::applyTranspositionOnTheLeft()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a4e3455bf12b56123e38a8220c6b508dc',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::applyTranspositionOnTheLeft()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a4e3455bf12b56123e38a8220c6b508dc',1,'PermutationBase< PermutationWrapper< _IndicesType > >::applyTranspositionOnTheLeft()']]], + ['applytranspositionontheright_515',['applyTranspositionOnTheRight',['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a5f98da0712570d0c4b12f61839ae4193',1,'Eigen::PermutationBase::applyTranspositionOnTheRight()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a5f98da0712570d0c4b12f61839ae4193',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::applyTranspositionOnTheRight()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a5f98da0712570d0c4b12f61839ae4193',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::applyTranspositionOnTheRight()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a5f98da0712570d0c4b12f61839ae4193',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::applyTranspositionOnTheRight()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a5f98da0712570d0c4b12f61839ae4193',1,'PermutationBase< PermutationWrapper< _IndicesType > >::applyTranspositionOnTheRight()']]], + ['applyzadjointontheleftinplace_516',['applyZAdjointOnTheLeftInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a0a89641e0b4ea92c515405f2a31e6abe',1,'Eigen::CompleteOrthogonalDecomposition']]], + ['applyzontheleftinplace_517',['applyZOnTheLeftInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#afedd1ee41b8490b70fd1fefdd21f8c80',1,'Eigen::CompleteOrthogonalDecomposition']]], + ['approxpolydp_518',['approxPolyDP',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga0012a5fdaea70b8a9970165d98722b4c',1,'cv::approxPolyDP()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga0012a5fdaea70b8a9970165d98722b4c',1,'approxPolyDP()(Global Namespace)']]], + ['apricot_519',['apricot',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#acccf8b8c34021cbba55353ac4af4bfb5',1,'cv::viz::Color']]], + ['apriltagcriticalrad_520',['aprilTagCriticalRad',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a99fc2fa5a18922e2e23865a118d0ea9a',1,'cv::aruco::DetectorParameters']]], + ['apriltagdeglitch_521',['aprilTagDeglitch',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#ab7ffda0665ca2ba83822b768f00ed946',1,'cv::aruco::DetectorParameters']]], + ['apriltagmaxlinefitmse_522',['aprilTagMaxLineFitMse',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a750257a7d94461485c9a181e24407250',1,'cv::aruco::DetectorParameters']]], + ['apriltagmaxnmaxima_523',['aprilTagMaxNmaxima',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#acf6a0da0ae6bcd582c51ae14263df87a',1,'cv::aruco::DetectorParameters']]], + ['apriltagminclusterpixels_524',['aprilTagMinClusterPixels',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#aa5be4f1c6ac11cc6209136c7ce226112',1,'cv::aruco::DetectorParameters']]], + ['apriltagminwhiteblackdiff_525',['aprilTagMinWhiteBlackDiff',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#ae0d308524dc4ea53d0257799254f18c2',1,'cv::aruco::DetectorParameters']]], + ['apriltagquaddecimate_526',['aprilTagQuadDecimate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#ac15a220f3f842e1b5c53d5f179a35ed9',1,'cv::aruco::DetectorParameters']]], + ['apriltagquadsigma_527',['aprilTagQuadSigma',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a9b3abaa8c7c29c6a5deb4e071b3acf76',1,'cv::aruco::DetectorParameters']]], + ['ar_528',['Ar',['../group__ar.html',1,'']]], + ['ar_5fhmdb_529',['AR_hmdb',['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1datasets_1_1AR__hmdb.html',1,'cv::datasets']]], + ['ar_5fhmdb_2ehpp_530',['ar_hmdb.hpp',['https://docs.opencv.org/4.2.0/d1/d98/ar__hmdb_8hpp.html',1,'']]], + ['ar_5fhmdbobj_531',['AR_hmdbObj',['https://docs.opencv.org/4.2.0/d1/da9/structcv_1_1datasets_1_1AR__hmdbObj.html',1,'cv::datasets']]], + ['ar_5fsports_532',['AR_sports',['https://docs.opencv.org/4.2.0/d5/d36/classcv_1_1datasets_1_1AR__sports.html',1,'cv::datasets']]], + ['ar_5fsports_2ehpp_533',['ar_sports.hpp',['https://docs.opencv.org/4.2.0/d7/d90/ar__sports_8hpp.html',1,'']]], + ['ar_5fsportsobj_534',['AR_sportsObj',['https://docs.opencv.org/4.2.0/d0/dec/structcv_1_1datasets_1_1AR__sportsObj.html',1,'cv::datasets']]], + ['arclength_535',['arcLength',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8d26483c636be6b35c3ec6335798a47c',1,'cv::arcLength()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8d26483c636be6b35c3ec6335798a47c',1,'arcLength()(Global Namespace)']]], + ['ardupilotprotocol_536',['ArduPilotProtocol',['../classnet_1_1ardupilot_1_1ArduPilotProtocol.html',1,'net::ardupilot']]], + ['are_5fdifferent_537',['are_different',['https://docs.opencv.org/4.2.0/d9/dab/namespacecv_1_1util_1_1detail.html#a8a9ff8065956085e2d25c1f146df6d27',1,'cv::util::detail']]], + ['are_5fmeta_5fdescrs_538',['are_meta_descrs',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#aa9a2d974aa7c71968bfd9649ee903a36',1,'cv::detail']]], + ['are_5fmeta_5fdescrs_5fbut_5flast_539',['are_meta_descrs_but_last',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a573723d31cccc765fe39151fe46a3649',1,'cv::detail']]], + ['area_540',['area',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a088c399363a9a5fb049a8d332ce4483e',1,'cv::text::ERStat::area'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a0dba3ba97160894da4b8c8b4d8712c8e',1,'cv::Rect_::area()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a8cc3d32e40c9b5324d316c35c4773dff',1,'cv::Size_::area()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a8cc3d32e40c9b5324d316c35c4773dff',1,'Size_< float >::area()']]], + ['area_5fheight_541',['area_height',['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#a9d3ab2324aeebf48861c1b8be475f71b',1,'cv::cudev::CommonAreaInterPtr::area_height'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#ad9d0d873010be71658a02874a3542605',1,'cv::cudev::IntegerAreaInterPtr::area_height']]], + ['area_5fwidth_542',['area_width',['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#a1e1cea958df9ae5cb84607588f7eb0b7',1,'cv::cudev::CommonAreaInterPtr::area_width'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#af6be746d742b89b83e88863b4ae3e040',1,'cv::cudev::IntegerAreaInterPtr::area_width']]], + ['arg_543',['arg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga943544cb1017a51d7cafc7b4d3cd022f',1,'std::arg(const complex< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac30364b7cb8121e0f4c42b2135ef8aa5',1,'std::arg(_Tp __x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga943544cb1017a51d7cafc7b4d3cd022f',1,'arg()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#aa539408a09481d35961e11ee78793db1',1,'Eigen::arg()']]], + ['arg1_544',['arg1',['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1Binder1st.html#af20116f988cdc40eb38d7f73d05dfd91',1,'cv::cudev::Binder1st::arg1'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseTernaryOp.html#a776de41baf8921bcdba24ec2166f0a3e',1,'Eigen::CwiseTernaryOp::arg1()']]], + ['arg2_545',['arg2',['https://docs.opencv.org/4.2.0/d6/db4/structcv_1_1cudev_1_1Binder2nd.html#acdc9f0eae0dad0515fdd90d14c482774',1,'cv::cudev::Binder2nd::arg2'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseTernaryOp.html#afebd6d4ed4101bcbb34c36f99ff27fda',1,'Eigen::CwiseTernaryOp::arg2() const']]], + ['arg3_546',['arg3',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseTernaryOp.html#a07e6cc21d253ae0bd68913fb65aa8151',1,'Eigen::CwiseTernaryOp']]], + ['argkind_547',['ArgKind',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#a97a661738725552712698d4c48b5d131',1,'cv::detail']]], + ['args_548',['args',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a291d5813cca476464022b0f009522741',1,'cv::ocl::Kernel']]], + ['argument_5ftype_549',['argument_type',['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'cv::cudev::unary_function::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< double, double >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< float, float >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< float, short >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< Op::first_argument_type, Op::result_type >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< Op::second_argument_type, Op::result_type >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< Predicate::argument_type, Predicate::result_type >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< schar, float >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< schar, schar >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< short, float >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< short, short >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< uchar, float >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< uchar, uchar >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< uint, float >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< uint, uint >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< ushort, float >::argument_type'],['https://docs.opencv.org/4.2.0/df/d11/structcv_1_1cudev_1_1unary__function.html#ae9c3b1479fca7f4d678999a91a436d6e',1,'unary_function< ushort, ushort >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_cxx::__detail::_Ffit_finder::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_cxx::binary_compose::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_cxx::select1st::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_cxx::select2nd::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_cxx::subtractive_rng::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_cxx::unary_compose::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_parallel::__binder1st::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_parallel::__binder2nd::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'__gnu_parallel::__unary_negate::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::_Maybe_unary_or_binary_function< _Res, _T1 >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::binder1st::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::binder2nd::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::const_mem_fun_ref_t::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::const_mem_fun_t::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::hash< __gnu_cxx::throw_value_limit >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::hash< __gnu_cxx::throw_value_random >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::logical_not::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::mem_fun_ref_t::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::mem_fun_t::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::negate::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::pointer_to_unary_function::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::unary_function::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'std::unary_negate::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< __gnu_cxx::throw_value_limit, size_t >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< __gnu_cxx::throw_value_random, size_t >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _FirstArgumentType, _ResultType >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Functor::argument_type, _Functor::result_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Operation2::argument_type, _Operation1::result_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Operation::first_argument_type, _Operation::result_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Operation::second_argument_type, _Operation::result_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Pair, _Pair::first_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Pair, _Pair::second_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Predicate::argument_type, bool >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _SecondArgumentType, _ResultType >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _T1, _Res >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Tp *, _Ret >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Tp, _Ret >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Tp, _Tp >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Tp, bool >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< _Value, _Value >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< argument_type, bool >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< const _Tp *, _Ret >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< pair< const _Key, _Tp >, pair< const _Key, _Tp > ::first_type >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< std::pair< _Tp, _Tp >, bool >::argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07347.html#a6e96c92b2592035c938f85ab1da1c876',1,'unary_function< unsigned int, unsigned int >::argument_type']]], + ['arguments_550',['G-API Graph Compilation Arguments',['https://docs.opencv.org/4.2.0/d9/d29/group__gapi__compile__args.html',1,'']]], + ['arithm_20operations_20on_20matrices_551',['Arithm Operations on Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'']]], + ['arithmetic_552',['Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01520.html',1,'Decimal Floating-Point Arithmetic'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html',1,'Rational Arithmetic']]], + ['arithmetic_553',['Matrix and vector arithmetic',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixArithmetic.html',1,'']]], + ['arithmetic_20classes_554',['Arithmetic Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01506.html',1,'']]], + ['arithmetic_20operations_20on_20images_555',['Arithmetic Operations on Images',['https://docs.opencv.org/4.2.0/d0/d86/tutorial_py_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_image_arithmetics.html',1,'Arithmetic Operations on Images']]], + ['arithmeticsequence_556',['ArithmeticSequence',['https://eigen.tuxfamily.org/dox/classEigen_1_1ArithmeticSequence.html',1,'Eigen']]], + ['arm_20based_20linux_20systems_557',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]], + ['arm_5fcrosscompile_5fwith_5fcmake_2emarkdown_558',['arm_crosscompile_with_cmake.markdown',['https://docs.opencv.org/4.2.0/d5/d49/arm__crosscompile__with__cmake_8markdown.html',1,'']]], + ['armiktask_559',['ArmIKTask',['../classnet_1_1mc_1_1tasks_1_1ArmIKTask.html',1,'net::mc::tasks']]], + ['armkinematics_560',['ArmKinematics',['../classkinematics_1_1ArmKinematics.html',1,'kinematics']]], + ['armkinematics_3c_202_2c_20n_20_3e_561',['ArmKinematics< 2, N >',['../classkinematics_1_1ArmKinematics.html',1,'kinematics']]], + ['aro_5f0_5f45_562',['ARO_0_45',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3ea29ee7f86306ebea2e7e489b307e27c3d',1,'cv::ximgproc']]], + ['aro_5f315_5f0_563',['ARO_315_0',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3ea7a68852e321bceeba7d63a2784400ee1',1,'cv::ximgproc']]], + ['aro_5f315_5f135_564',['ARO_315_135',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3eacf201e7104201a24452e6ade448de92f',1,'cv::ximgproc']]], + ['aro_5f315_5f45_565',['ARO_315_45',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3eadc2b721b1557d012403d37f6a30e0d3a',1,'cv::ximgproc']]], + ['aro_5f45_5f135_566',['ARO_45_135',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3ea2e520252ceea6620dda5c8b403cfac0a',1,'cv::ximgproc']]], + ['aro_5f45_5f90_567',['ARO_45_90',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3eaa8d304ccb0d916daaf7ba094f40e7273',1,'cv::ximgproc']]], + ['aro_5f90_5f135_568',['ARO_90_135',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3eab091550fe679b3fec9aff3efe7529810',1,'cv::ximgproc']]], + ['aro_5fctr_5fhor_569',['ARO_CTR_HOR',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3ea728dc85bd644c37d0b17da12800fd266',1,'cv::ximgproc']]], + ['aro_5fctr_5fver_570',['ARO_CTR_VER',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a6084e9c9732060c84a1e5fc55062dd3eaca048d27204d9cd39c4af66d86295d2f',1,'cv::ximgproc']]], + ['array_571',['Array',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'Eigen::Array< class, _Rows, _Cols, _Options, _MaxRows, _MaxCols >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Eigen::Array::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Eigen::Array::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Eigen::Array::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Eigen::Array::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Eigen::Array::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Eigen::Array::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Eigen::Array::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Eigen::Array::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Eigen::Array::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Eigen::Array::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Eigen::Array::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Eigen::Array::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< double, DPARM_SIZE, 1 >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< double, DPARM_SIZE, 1 >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< double, DPARM_SIZE, 1 >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< double, DPARM_SIZE, 1 >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< double, DPARM_SIZE, 1 >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< double, DPARM_SIZE, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< double, DPARM_SIZE, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< double, DPARM_SIZE, 1 >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< double, DPARM_SIZE, 1 >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< double, DPARM_SIZE, 1 >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< double, DPARM_SIZE, 1 >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< double, DPARM_SIZE, 1 >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< double, UMFPACK_CONTROL, 1 >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< double, UMFPACK_CONTROL, 1 >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< double, UMFPACK_INFO, 1 >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< double, UMFPACK_INFO, 1 >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< double, UMFPACK_INFO, 1 >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< double, UMFPACK_INFO, 1 >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< double, UMFPACK_INFO, 1 >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< double, UMFPACK_INFO, 1 >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< Index, 1, Dynamic >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< Index, 1, Dynamic >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< Index, 1, Dynamic >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< Index, 1, Dynamic >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< Index, 1, Dynamic >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< Index, 1, Dynamic >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< Index, 1, Dynamic >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< Index, 1, Dynamic >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< Index, 1, Dynamic >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< Index, 1, Dynamic >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< Index, 1, Dynamic >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< Index, 1, Dynamic >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< int, IPARM_SIZE, 1 >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< int, IPARM_SIZE, 1 >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< int, IPARM_SIZE, 1 >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< int, IPARM_SIZE, 1 >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< int, IPARM_SIZE, 1 >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< int, IPARM_SIZE, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< int, IPARM_SIZE, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< int, IPARM_SIZE, 1 >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< int, IPARM_SIZE, 1 >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< int, IPARM_SIZE, 1 >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< int, IPARM_SIZE, 1 >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< int, IPARM_SIZE, 1 >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< RealScalar, Dynamic, 1 >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< RealScalar, Dynamic, 1 >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< RealScalar, Dynamic, 1 >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< RealScalar, Dynamic, 1 >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< RealScalar, Dynamic, 1 >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< RealScalar, Dynamic, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< RealScalar, Dynamic, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< RealScalar, Dynamic, 1 >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< RealScalar, Dynamic, 1 >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< RealScalar, Dynamic, 1 >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< RealScalar, Dynamic, 1 >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< RealScalar, Dynamic, 1 >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< StorageIndex, 2, 1 >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< StorageIndex, 2, 1 >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< StorageIndex, 2, 1 >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< StorageIndex, 2, 1 >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< StorageIndex, 2, 1 >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< StorageIndex, 2, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< StorageIndex, 2, 1 >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< StorageIndex, 2, 1 >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< StorageIndex, 2, 1 >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< StorageIndex, 2, 1 >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< StorageIndex, 2, 1 >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< StorageIndex, 2, 1 >::Array(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ad9f6f2c9890092e12fd3344aa6ffcbd1',1,'Array< StorageIndex, 64, 1, DontAlign >::Array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa1ef64a2517d538e03b71584369e14bb',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a295b8d13170c4512480bc74ef9de4299',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const EigenBase< OtherDerived > &other, typename internal::enable_if< internal::is_convertible< typename OtherDerived::Scalar, Scalar >::value, PrivateType >::type=PrivateType())'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3d375f13801bb5db4c3d8eaa5b05aa08',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a3b781cdd2aa6fa9421047e6bc29d1bf6',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Scalar &val0, const Scalar &val1)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ae20df0e99b3a2bcf35f6cf83755a1f80',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a00db21a7dd3a6e4df632913204742466',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Scalar &val0, const Scalar &val1, const Scalar &val2, const Scalar &val3)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a60196d3a62e1d19746e011dd1cefdfc5',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a2c3f6165e88d157195d87c9bc44d9fc0',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#aa8732ffb15d620d7091e10f963548390',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a0b8a25eb8bde16732c95eaad8a8a8b85',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a473a6a8fdd69a31312efaf6bdb3fc546',1,'Array< StorageIndex, 64, 1, DontAlign >::Array(Index rows, Index cols)']]], + ['array_572',['array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01703.html',1,'std::array< _Tp, _Nm >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00041.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1cudev_1_1ArrayWrapper.html#a306fd296d76159d85ca6d90f4741ce9f',1,'cv::cudev::ArrayWrapper::array'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a354c33eec32ceb4193d002f4d41c0497',1,'Eigen::MatrixBase::array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a72f287fe7b2a7e7a66d16cc88166d47f',1,'Eigen::MatrixBase::array() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a354c33eec32ceb4193d002f4d41c0497',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a72f287fe7b2a7e7a66d16cc88166d47f',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::array() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a354c33eec32ceb4193d002f4d41c0497',1,'MatrixBase< Solve< Decomposition, RhsType > >::array()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a72f287fe7b2a7e7a66d16cc88166d47f',1,'MatrixBase< Solve< Decomposition, RhsType > >::array() const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a2c8d8f5741aedadac8f3bffd8f2ce13e.html#a2c8d8f5741aedadac8f3bffd8f2ce13e',1,'nlohmann::basic_json::array()']]], + ['array_20class_20and_20coefficient_20wise_20operations_573',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], + ['array_20creation_20functions_574',['Array creation functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01523.html',1,'']]], + ['array_20manipulation_575',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], + ['array_20typedefs_576',['Global array typedefs',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html',1,'']]], + ['array2_577',['Array2',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga27e36e9e1da10f2c17d69bbfa7ead870',1,'Eigen::Array2'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga27e36e9e1da10f2c17d69bbfa7ead870',1,'Array2(Global Namespace)']]], + ['array22_578',['Array22',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gad5e10990863f064300d78e80b4537a0b',1,'Eigen::Array22'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gad5e10990863f064300d78e80b4537a0b',1,'Array22(Global Namespace)']]], + ['array2x_579',['Array2X',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga995df558b61646d505b9feabd30a28d0',1,'Eigen::Array2X'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga995df558b61646d505b9feabd30a28d0',1,'Array2X(Global Namespace)']]], + ['array3_580',['Array3',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga7ca781ec91d7b715d226d5057d50b250',1,'Eigen::Array3'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga7ca781ec91d7b715d226d5057d50b250',1,'Array3(Global Namespace)']]], + ['array33_581',['Array33',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gafb8560ef95ce6a7284131d91da82cf8a',1,'Eigen::Array33'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gafb8560ef95ce6a7284131d91da82cf8a',1,'Array33(Global Namespace)']]], + ['array3x_582',['Array3X',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gaf24f8bd443138027dd02599e7c58ef60',1,'Eigen::Array3X'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gaf24f8bd443138027dd02599e7c58ef60',1,'Array3X(Global Namespace)']]], + ['array4_583',['Array4',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga2b5e91e45a496f9893059ab4f298a9ee',1,'Eigen::Array4'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga2b5e91e45a496f9893059ab4f298a9ee',1,'Array4(Global Namespace)']]], + ['array44_584',['Array44',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gabcb97c1d614be824fd355ca29632e30f',1,'Eigen::Array44'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gabcb97c1d614be824fd355ca29632e30f',1,'Array44(Global Namespace)']]], + ['array4x_585',['Array4X',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gaab59985198663295e89134835783bd0d',1,'Eigen::Array4X'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gaab59985198663295e89134835783bd0d',1,'Array4X(Global Namespace)']]], + ['array_3c_20dim_20_3e_586',['Array< dim >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'Eigen']]], + ['array_3c_20double_2c_20dparm_5fsize_2c_201_20_3e_587',['Array< double, DPARM_SIZE, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], + ['array_3c_20double_2c_20umfpack_5fcontrol_2c_201_20_3e_588',['Array< double, UMFPACK_CONTROL, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], + ['array_3c_20double_2c_20umfpack_5finfo_2c_201_20_3e_589',['Array< double, UMFPACK_INFO, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], + ['array_3c_20filters_3a_3aoutput_2c_20numoutputs_20_3e_590',['array< filters::Output, numOutputs >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01703.html',1,'std']]], + ['array_3c_20index_2c_201_2c_20dynamic_20_3e_591',['Array< Index, 1, Dynamic >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], + ['array_3c_20int_2c_20iparm_5fsize_2c_201_20_3e_592',['Array< int, IPARM_SIZE, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], + ['array_3c_20n_20_3e_593',['Array< N >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'Eigen']]], + ['array_3c_20realscalar_2c_20dynamic_2c_201_20_3e_594',['Array< RealScalar, Dynamic, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], + ['array_3c_20storageindex_2c_202_2c_201_20_3e_595',['Array< StorageIndex, 2, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], + ['array_3c_20storageindex_2c_2064_2c_201_2c_20dontalign_20_3e_596',['Array< StorageIndex, 64, 1, DontAlign >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html',1,'']]], + ['array_5fallocator_597',['array_allocator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10251.html',1,'__gnu_cxx']]], + ['array_5fallocator_2eh_598',['array_allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01028.html',1,'']]], + ['array_5fallocator_5fbase_599',['array_allocator_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10247.html',1,'__gnu_cxx']]], + ['array_5fbuffer_600',['ARRAY_BUFFER',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a830568a629457171cb07918537ec66bea62a4126c42da95e41facc4f84475f44a',1,'cv::ogl::Buffer']]], + ['array_5ft_601',['array_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a858c1cf8407bc06494e3a1114a3b73e7.html#a858c1cf8407bc06494e3a1114a3b73e7',1,'nlohmann::basic_json']]], + ['arraybase_602',['ArrayBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html',1,'Eigen']]], + ['arraybase_3c_20arraywrapper_3c_20expressiontype_20_3e_20_3e_603',['ArrayBase< ArrayWrapper< ExpressionType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html',1,'']]], + ['arrayint_604',['arrayInt',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#ab87209295a63ac51a40129074c08546e',1,'cv::dnn::DictValue']]], + ['arrayreal_605',['arrayReal',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a904c466e944eecf6683d5bba8d89984c',1,'cv::dnn::DictValue']]], + ['arrays_606',['Arrays',['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html',1,'cv::ogl::Arrays'],['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#ad7084cc4c4d8f6a6b381480088fea7e7',1,'cv::ogl::Arrays::Arrays()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html',1,'Numeric Arrays']]], + ['arrays_607',['arrays',['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a001ac5692124eefacd223ab4c26a430f',1,'cv::NAryMatIterator::arrays'],['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'Explanation of the assertion on unaligned arrays'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html',1,'Operations on arrays']]], + ['arraystring_608',['arrayString',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a80564c784d4513f070a60f781b8d7c58',1,'cv::dnn::DictValue']]], + ['arraywrapper_609',['ArrayWrapper',['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1cudev_1_1ArrayWrapper.html',1,'cv::cudev::ArrayWrapper< class, COUNT >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayWrapper.html',1,'Eigen::ArrayWrapper< class >']]], + ['arrayx_610',['ArrayX',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga9f9db3ea1c9715a30ed77c6cd434bbd3',1,'Eigen::ArrayX'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga9f9db3ea1c9715a30ed77c6cd434bbd3',1,'ArrayX(Global Namespace)']]], + ['arrayx2_611',['ArrayX2',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga273e82d1306290af7e02aeb75a831fca',1,'Eigen::ArrayX2'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga273e82d1306290af7e02aeb75a831fca',1,'ArrayX2(Global Namespace)']]], + ['arrayx3_612',['ArrayX3',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga428c78ad433d2f285650ccee8fc0f29f',1,'Eigen::ArrayX3'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga428c78ad433d2f285650ccee8fc0f29f',1,'ArrayX3(Global Namespace)']]], + ['arrayx4_613',['ArrayX4',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gaad02550dee7a18c7a74941be73de327d',1,'Eigen::ArrayX4'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#gaad02550dee7a18c7a74941be73de327d',1,'ArrayX4(Global Namespace)']]], + ['arrayxpr_614',['ArrayXpr',['https://eigen.tuxfamily.org/dox/structEigen_1_1ArrayXpr.html',1,'Eigen']]], + ['arrayxx_615',['ArrayXX',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga6a3ca2b2a8694c17ed25ac03cafdaa04',1,'Eigen::ArrayXX'],['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html#ga6a3ca2b2a8694c17ed25ac03cafdaa04',1,'ArrayXX(Global Namespace)']]], + ['arrowedline_616',['arrowedLine',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga0a165a3ca093fd488ac709fdf10c05b2',1,'cv::arrowedLine()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga0a165a3ca093fd488ac709fdf10c05b2',1,'arrowedLine(InputOutputArray img, Point pt1, Point pt2, const Scalar &color, int thickness=1, int line_type=8, int shift=0, double tipLength=0.1)(Global Namespace)']]], + ['aruco_20and_20charuco_617',['Calibration with ArUco and ChArUco',['https://docs.opencv.org/4.2.0/da/d13/tutorial_aruco_calibration.html',1,'']]], + ['aruco_20boards_618',['Detection of ArUco Boards',['https://docs.opencv.org/4.2.0/db/da9/tutorial_aruco_board_detection.html',1,'']]], + ['aruco_20marker_20detection_619',['ArUco Marker Detection',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html',1,'']]], + ['aruco_20marker_20detection_20aruco_20module_620',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], + ['aruco_20markers_621',['Detection of ArUco Markers',['https://docs.opencv.org/4.2.0/d5/dae/tutorial_aruco_detection.html',1,'']]], + ['aruco_20module_622',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], + ['aruco_20module_20faq_623',['Aruco module FAQ',['https://docs.opencv.org/4.2.0/d1/dcb/tutorial_aruco_faq.html',1,'']]], + ['aruco_2ehpp_624',['aruco.hpp',['https://docs.opencv.org/4.2.0/d9/d53/aruco_8hpp.html',1,'']]], + ['aruco_5fboard_5fdetection_2emarkdown_625',['aruco_board_detection.markdown',['https://docs.opencv.org/4.2.0/de/d6c/aruco__board__detection_8markdown.html',1,'']]], + ['aruco_5fcalibration_2emarkdown_626',['aruco_calibration.markdown',['https://docs.opencv.org/4.2.0/d6/d1e/aruco__calibration_8markdown.html',1,'']]], + ['aruco_5fdetection_2emarkdown_627',['aruco_detection.markdown',['https://docs.opencv.org/4.2.0/db/d20/aruco__detection_8markdown.html',1,'']]], + ['aruco_5ffaq_2emarkdown_628',['aruco_faq.markdown',['https://docs.opencv.org/4.2.0/da/d22/aruco__faq_8markdown.html',1,'']]], + ['as_20a_20paint_20brush_629',['Mouse as a Paint-Brush',['https://docs.opencv.org/4.2.0/db/d5b/tutorial_py_mouse_handling.html',1,'']]], + ['as_20parameters_630',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], + ['as_20the_20color_20palette_631',['Trackbar as the Color Palette',['https://docs.opencv.org/4.2.0/d9/dc8/tutorial_py_trackbar.html',1,'']]], + ['as_5fis_632',['AS_IS',['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#af76d4f81be079787300899fbfaaf92d3a3aa37e46f04bc8e707fca72d592023eb',1,'cv::detail::Timelapser']]], + ['ascii_633',['ascii',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a5b53c2c5ad9b511c364628ec7ddeccf1',1,'cv::QtFont']]], + ['asdiagonal_634',['asDiagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a14235b62c90f93fe910070b4743782d0',1,'Eigen::MatrixBase::asDiagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a14235b62c90f93fe910070b4743782d0',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::asDiagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a14235b62c90f93fe910070b4743782d0',1,'MatrixBase< Solve< Decomposition, RhsType > >::asDiagonal()']]], + ['asgd_635',['ASGD',['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#ab028695cc8ec1491888d8d03f80bc8c2abb41d794ce113aa2123f45120e8354af',1,'cv::ml::SVMSGD']]], + ['asin_636',['asin',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d46b675147054f73255bcba75d2ab2e',1,'cv::cudev::asin(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb2753cc55aa711c823538038b40d11b',1,'cv::cudev::asin(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63c8961b3773b34212feab8f14f1729c',1,'cv::cudev::asin(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d2e866011556264911b29da48da6018',1,'cv::cudev::asin(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f67153a2fd5eb29d198c0b99eeacffd',1,'cv::cudev::asin(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64b6a4a32fc7d97c581d984576601cf0',1,'cv::cudev::asin(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac99e4184ec869539d1280a6ad1393700',1,'cv::cudev::asin(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafffa8116a049d289c27af484c6f3421f',1,'cv::cudev::asin(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga119b8d3ac04d54cee8efdd520ed3c132',1,'cv::cudev::asin(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a5c23e79ad43591812ac9ed61807868',1,'cv::cudev::asin(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7a28532390be9aa4666ffbc0a1a8808',1,'cv::cudev::asin(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac673b4c0ee7fde2752d6b86c755cb095',1,'cv::cudev::asin(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e94eafb3f81815fa021af5082a3ce37',1,'cv::cudev::asin(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f3aefa0e51d807a1f87dfbef16deef9',1,'cv::cudev::asin(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabffd5eab69bbbc638f72684a3d3fff00',1,'cv::cudev::asin(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70e9468af3ef289f268f1676722d8406',1,'cv::cudev::asin(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c73156810c59fbc6e615b67bb648573',1,'cv::cudev::asin(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73714fb2c8eb5e087d8c87fbebed0407',1,'cv::cudev::asin(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c097cab8ed2db0d2438670a6f0bbec1',1,'cv::cudev::asin(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga099c63fbc8aecbf8634d6692e53773b8',1,'cv::cudev::asin(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1a956b44859dd3247028efb751fb48b',1,'cv::cudev::asin(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab79a285c3d833cf267899dd5e8e60633',1,'cv::cudev::asin(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92825e462c1965828eee02edd9090177',1,'cv::cudev::asin(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc49fada95c5ce84d80b0df9c3d8834f',1,'cv::cudev::asin(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e26fb2a948b29029faf17f9c3a78311',1,'cv::cudev::asin(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac068b5ae5ba49af36f0d3d769c940309',1,'cv::cudev::asin(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa996799ef9bbfadeb14f7b8b966bc50c',1,'cv::cudev::asin(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8415495cd60820deb62bb62c64db5e9',1,'cv::cudev::asin(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49f25e71abd12478dc823ca2abd97d3f',1,'cv::cudev::asin(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d181b76005b39f7261d703b4c2c0428',1,'cv::cudev::asin(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3781726cc650d01884d17b09768f5015',1,'cv::cudev::asin(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga181b9599b639820b0402e7d73f89091a',1,'cv::cudev::asin(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d46b675147054f73255bcba75d2ab2e',1,'asin(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb2753cc55aa711c823538038b40d11b',1,'asin(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63c8961b3773b34212feab8f14f1729c',1,'asin(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d2e866011556264911b29da48da6018',1,'asin(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f67153a2fd5eb29d198c0b99eeacffd',1,'asin(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64b6a4a32fc7d97c581d984576601cf0',1,'asin(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac99e4184ec869539d1280a6ad1393700',1,'asin(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafffa8116a049d289c27af484c6f3421f',1,'asin(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga119b8d3ac04d54cee8efdd520ed3c132',1,'asin(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a5c23e79ad43591812ac9ed61807868',1,'asin(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7a28532390be9aa4666ffbc0a1a8808',1,'asin(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac673b4c0ee7fde2752d6b86c755cb095',1,'asin(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e94eafb3f81815fa021af5082a3ce37',1,'asin(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f3aefa0e51d807a1f87dfbef16deef9',1,'asin(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabffd5eab69bbbc638f72684a3d3fff00',1,'asin(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70e9468af3ef289f268f1676722d8406',1,'asin(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c73156810c59fbc6e615b67bb648573',1,'asin(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73714fb2c8eb5e087d8c87fbebed0407',1,'asin(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c097cab8ed2db0d2438670a6f0bbec1',1,'asin(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga099c63fbc8aecbf8634d6692e53773b8',1,'asin(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1a956b44859dd3247028efb751fb48b',1,'asin(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab79a285c3d833cf267899dd5e8e60633',1,'asin(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92825e462c1965828eee02edd9090177',1,'asin(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc49fada95c5ce84d80b0df9c3d8834f',1,'asin(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e26fb2a948b29029faf17f9c3a78311',1,'asin(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac068b5ae5ba49af36f0d3d769c940309',1,'asin(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa996799ef9bbfadeb14f7b8b966bc50c',1,'asin(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8415495cd60820deb62bb62c64db5e9',1,'asin(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49f25e71abd12478dc823ca2abd97d3f',1,'asin(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d181b76005b39f7261d703b4c2c0428',1,'asin(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3781726cc650d01884d17b09768f5015',1,'asin(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga181b9599b639820b0402e7d73f89091a',1,'asin(const double1 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af94e28dea7bd5b71959fbc6be1070895',1,'std::asin()'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a6c5c246b877ac331495d21e7a5d51616',1,'Eigen::asin()']]], + ['asin_5f_637',['asin_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b197e2eb35f84ac96c413917b4893f2',1,'cv::cudev::asin_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b197e2eb35f84ac96c413917b4893f2',1,'asin_()(Global Namespace)']]], + ['asin_5ffunc_638',['asin_func',['https://docs.opencv.org/4.2.0/d9/dee/structcv_1_1cudev_1_1asin__func.html',1,'cv::cudev']]], + ['asin_5ffunc_3c_20double_20_3e_639',['asin_func< double >',['https://docs.opencv.org/4.2.0/d6/d59/structcv_1_1cudev_1_1asin__func_3_01double_01_4.html',1,'cv::cudev']]], + ['asin_5ffunc_3c_20float_20_3e_640',['asin_func< float >',['https://docs.opencv.org/4.2.0/d5/d96/structcv_1_1cudev_1_1asin__func_3_01float_01_4.html',1,'cv::cudev']]], + ['asin_5ffunc_3c_20schar_20_3e_641',['asin_func< schar >',['https://docs.opencv.org/4.2.0/d9/da3/structcv_1_1cudev_1_1asin__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['asin_5ffunc_3c_20short_20_3e_642',['asin_func< short >',['https://docs.opencv.org/4.2.0/d1/d16/structcv_1_1cudev_1_1asin__func_3_01short_01_4.html',1,'cv::cudev']]], + ['asin_5ffunc_3c_20uchar_20_3e_643',['asin_func< uchar >',['https://docs.opencv.org/4.2.0/da/d71/structcv_1_1cudev_1_1asin__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['asin_5ffunc_3c_20uint_20_3e_644',['asin_func< uint >',['https://docs.opencv.org/4.2.0/d7/d65/structcv_1_1cudev_1_1asin__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['asin_5ffunc_3c_20ushort_20_3e_645',['asin_func< ushort >',['https://docs.opencv.org/4.2.0/d1/d46/structcv_1_1cudev_1_1asin__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['asinh_646',['asinh',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8efaf691d9c74b362a43b1b793706ea1',1,'Eigen::MatrixBase::asinh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8efaf691d9c74b362a43b1b793706ea1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::asinh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8efaf691d9c74b362a43b1b793706ea1',1,'MatrixBase< Solve< Decomposition, RhsType > >::asinh()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbd44b57c61d92a19c2f1c0a3eea904b',1,'cv::cudev::asinh(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3efff6ed67ee0a099661c85d6857d60e',1,'cv::cudev::asinh(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8da92b6ef8c1631bfbb45735a9148e6',1,'cv::cudev::asinh(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac02b7c2e2106fb1e0f80643c10bd2cf6',1,'cv::cudev::asinh(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fd4981a7d9be01ea405b55431827410',1,'cv::cudev::asinh(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga632bac3bc491416ce1ea446a2f00b987',1,'cv::cudev::asinh(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5141b961093114d2403503fd91450119',1,'cv::cudev::asinh(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6c3aeea0ac7fecbb340c3dc17c90afd',1,'cv::cudev::asinh(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59a473e70af307dd88d10a623e10e701',1,'cv::cudev::asinh(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9e8311550bead336d93a88067bc01a6',1,'cv::cudev::asinh(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4095d6f79c02f60405f7ace4591b2a08',1,'cv::cudev::asinh(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b36f34a780166b3a28603ea8daf2945',1,'cv::cudev::asinh(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1bda833fdfe3bbd7ca67cac28b76158',1,'cv::cudev::asinh(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395725ba1a3f3f138834c6dbca55a261',1,'cv::cudev::asinh(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f2706206f5121113e535b8188245459',1,'cv::cudev::asinh(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b7fc019908070e31838d0b9cae21d0f',1,'cv::cudev::asinh(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b051dcc3d2aa43bbb19bdc9c1fc9921',1,'cv::cudev::asinh(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga091506e5fe8a4ef0274ffef7af553f51',1,'cv::cudev::asinh(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f5dade9e6299b9fe8befbecd65c5c2',1,'cv::cudev::asinh(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga583369524722ea3d3909fab1658a2526',1,'cv::cudev::asinh(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga899821e3a4aac460c4ba2ea7b3162ffb',1,'cv::cudev::asinh(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga352dae34f3bd33ad2b4c424e11f5a107',1,'cv::cudev::asinh(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace822c9a93f63fda202e490665c562aa',1,'cv::cudev::asinh(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd2b0277e482d96d5448688b01472f93',1,'cv::cudev::asinh(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c783ad414f1188af62dc76ec789e134',1,'cv::cudev::asinh(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf0c6a0db0c74d45bd1611ab73b0fb3a',1,'cv::cudev::asinh(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebd050be09fca79f1f2a4539e2c5e21a',1,'cv::cudev::asinh(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157bf56136ef621f607a321bfc8153c4',1,'cv::cudev::asinh(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034295abeff6dbf5ce8bc1acf081ea7e',1,'cv::cudev::asinh(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9a1236429d0d60cfaf181900531bd7f',1,'cv::cudev::asinh(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ff90e7522c57f55d75dc4016ff82d51',1,'cv::cudev::asinh(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga729ef6c6dd550b9a1da561af542f5caf',1,'cv::cudev::asinh(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbd44b57c61d92a19c2f1c0a3eea904b',1,'asinh(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3efff6ed67ee0a099661c85d6857d60e',1,'asinh(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8da92b6ef8c1631bfbb45735a9148e6',1,'asinh(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac02b7c2e2106fb1e0f80643c10bd2cf6',1,'asinh(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fd4981a7d9be01ea405b55431827410',1,'asinh(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga632bac3bc491416ce1ea446a2f00b987',1,'asinh(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5141b961093114d2403503fd91450119',1,'asinh(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6c3aeea0ac7fecbb340c3dc17c90afd',1,'asinh(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59a473e70af307dd88d10a623e10e701',1,'asinh(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9e8311550bead336d93a88067bc01a6',1,'asinh(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4095d6f79c02f60405f7ace4591b2a08',1,'asinh(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b36f34a780166b3a28603ea8daf2945',1,'asinh(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1bda833fdfe3bbd7ca67cac28b76158',1,'asinh(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395725ba1a3f3f138834c6dbca55a261',1,'asinh(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f2706206f5121113e535b8188245459',1,'asinh(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b7fc019908070e31838d0b9cae21d0f',1,'asinh(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b051dcc3d2aa43bbb19bdc9c1fc9921',1,'asinh(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga091506e5fe8a4ef0274ffef7af553f51',1,'asinh(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f5dade9e6299b9fe8befbecd65c5c2',1,'asinh(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga583369524722ea3d3909fab1658a2526',1,'asinh(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga899821e3a4aac460c4ba2ea7b3162ffb',1,'asinh(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga352dae34f3bd33ad2b4c424e11f5a107',1,'asinh(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace822c9a93f63fda202e490665c562aa',1,'asinh(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd2b0277e482d96d5448688b01472f93',1,'asinh(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c783ad414f1188af62dc76ec789e134',1,'asinh(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf0c6a0db0c74d45bd1611ab73b0fb3a',1,'asinh(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebd050be09fca79f1f2a4539e2c5e21a',1,'asinh(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157bf56136ef621f607a321bfc8153c4',1,'asinh(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034295abeff6dbf5ce8bc1acf081ea7e',1,'asinh(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9a1236429d0d60cfaf181900531bd7f',1,'asinh(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ff90e7522c57f55d75dc4016ff82d51',1,'asinh(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga729ef6c6dd550b9a1da561af542f5caf',1,'asinh(const double1 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2135f46a5a1fcc1cd3399ef4e20f6249',1,'std::asinh()'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a727dd851cc82a62574145bc5abdc7aed',1,'Eigen::asinh()']]], + ['asinh_5f_647',['asinh_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b664c30c6d7e3a2e7718ee996979978',1,'cv::cudev::asinh_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b664c30c6d7e3a2e7718ee996979978',1,'asinh_()(Global Namespace)']]], + ['asinh_5ffunc_648',['asinh_func',['https://docs.opencv.org/4.2.0/d0/d43/structcv_1_1cudev_1_1asinh__func.html',1,'cv::cudev']]], + ['asinh_5ffunc_3c_20double_20_3e_649',['asinh_func< double >',['https://docs.opencv.org/4.2.0/d7/da8/structcv_1_1cudev_1_1asinh__func_3_01double_01_4.html',1,'cv::cudev']]], + ['asinh_5ffunc_3c_20float_20_3e_650',['asinh_func< float >',['https://docs.opencv.org/4.2.0/d1/d1c/structcv_1_1cudev_1_1asinh__func_3_01float_01_4.html',1,'cv::cudev']]], + ['asinh_5ffunc_3c_20schar_20_3e_651',['asinh_func< schar >',['https://docs.opencv.org/4.2.0/db/db5/structcv_1_1cudev_1_1asinh__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['asinh_5ffunc_3c_20short_20_3e_652',['asinh_func< short >',['https://docs.opencv.org/4.2.0/df/da7/structcv_1_1cudev_1_1asinh__func_3_01short_01_4.html',1,'cv::cudev']]], + ['asinh_5ffunc_3c_20uchar_20_3e_653',['asinh_func< uchar >',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1cudev_1_1asinh__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['asinh_5ffunc_3c_20uint_20_3e_654',['asinh_func< uint >',['https://docs.opencv.org/4.2.0/d6/d27/structcv_1_1cudev_1_1asinh__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['asinh_5ffunc_3c_20ushort_20_3e_655',['asinh_func< ushort >',['https://docs.opencv.org/4.2.0/d6/dc2/structcv_1_1cudev_1_1asinh__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['asinterleaved_656',['asInterleaved',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#ac7d2267acbbc949cf82a5d35b6942847',1,'cv::GMatDesc']]], + ['asked_20questions_657',['Frequently Asked Questions',['https://docs.opencv.org/4.2.0/d3/d2d/faq.html',1,'']]], + ['aspect_658',['aspect',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#af75930059b53838d8d65ae8b677840da',1,'cv::detail::CameraParams']]], + ['aspectratio_659',['aspectRatio',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2b608524f19d01184e6e954b976e102f',1,'cv::Size_::aspectRatio()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2b608524f19d01184e6e954b976e102f',1,'Size_< float >::aspectRatio()']]], + ['asplanar_660',['asPlanar',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#ac3db4ce0b4c2bc2a9c7931b1898c90f6',1,'cv::GMatDesc::asPlanar() const'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a47e313dd951214fbe2469a956af24944',1,'cv::GMatDesc::asPlanar(int planes) const']]], + ['assert_2ehpp_661',['assert.hpp',['https://docs.opencv.org/4.2.0/d2/d54/assert_8hpp.html',1,'']]], + ['assert_5fpredictions_662',['assert_predictions',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a7934b3d0aeb136e71abf2f410230d113',1,'cv::dnn_objdetect::InferBbox']]], + ['assertion_20on_20unaligned_20arrays_663',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], + ['assertions_664',['Assertions',['https://eigen.tuxfamily.org/dox/TopicAssertions.html',1,'']]], + ['assertions_2eh_665',['assertions.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00749.html',1,'']]], + ['asserttest_666',['assertTest',['https://docs.opencv.org/4.2.0/d0/d93/structNcvCTprep_1_1assertTest.html',1,'NcvCTprep']]], + ['assign_667',['assign',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a6aeb30bb97609c10c16b76952fb1715c',1,'cv::_OutputArray::assign(const UMat &u) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ab1c94d2b81fca98114fca897f71f83ee',1,'cv::_OutputArray::assign(const Mat &m) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a6cb7978cd5415cefa1656bb3156b138d',1,'cv::_OutputArray::assign(const std::vector< UMat > &v) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#abd47d94d5cc2cc5889e3ae61a9f84472',1,'cv::_OutputArray::assign(const std::vector< Mat > &v) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#af439e10effa2d7f7c093b194f563e8fd',1,'cv::cudev::GpuMat_::assign()'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a655357fd7395545f8e16638fe53678d0',1,'cv::MatOp::assign()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2f8201f5e82e07e27c2f39f13a1c04a9',1,'__gnu_cxx::__versa_string::assign(const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a34d8c156d115ee2ee8ec527d324581b1',1,'__gnu_cxx::__versa_string::assign(__versa_string &&__str) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab5ba7120a3e81545fcbdbf055c8e392d',1,'__gnu_cxx::__versa_string::assign(const __versa_string &__str, size_type __pos, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a861c4286beece654abd5b3a828f4ff49',1,'__gnu_cxx::__versa_string::assign(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9faa9dc311635300ef2e2fee77262b61',1,'__gnu_cxx::__versa_string::assign(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#acf5a7b1fd517200f124373026b7bd807',1,'__gnu_cxx::__versa_string::assign(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a0cd3b8029b8958b6f02852e240b50899',1,'__gnu_cxx::__versa_string::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab375104c3d2ef95f7d2b56a25d91bef8',1,'__gnu_cxx::__versa_string::assign(std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'__gnu_debug::basic_string::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'__gnu_debug::basic_string::assign(basic_string &&__str) noexcept(allocator_traits< _Allocator >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'__gnu_debug::basic_string::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< _CharT >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< _CharT >::assign(basic_string &&__str) noexcept(allocator_traits< _Alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< _CharT >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< _CharT >::assign(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< _CharT >::assign(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< _CharT >::assign(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< _CharT >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< _CharT >::assign(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< _CharT, _Traits, _Allocator >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< _CharT, _Traits, _Allocator >::assign(basic_string &&__str) noexcept(allocator_traits< _Allocator >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< _CharT, _Traits, _Allocator >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< _CharT, _Traits, _Allocator >::assign(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< _CharT, _Traits, _Allocator >::assign(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< _CharT, _Traits, _Allocator >::assign(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< _CharT, _Traits, _Allocator >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< _CharT, _Traits, _Allocator >::assign(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(basic_string &&__str) noexcept(allocator_traits< _Wide_alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(const _Elem *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(size_type __n, _Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::assign(initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< char >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< char >::assign(basic_string &&__str) noexcept(allocator_traits< _Alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< char >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< char >::assign(const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< char >::assign(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< char >::assign(size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< char >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< char >::assign(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(basic_string &&__str) noexcept(allocator_traits< _Byte_alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(const char *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(size_type __n, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::assign(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< char_type, _Traits, _Alloc >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< char_type, _Traits, _Alloc >::assign(basic_string &&__str) noexcept(allocator_traits< _Alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< char_type, _Traits, _Alloc >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< char_type, _Traits, _Alloc >::assign(const char_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< char_type, _Traits, _Alloc >::assign(const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< char_type, _Traits, _Alloc >::assign(size_type __n, char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< char_type, _Traits, _Alloc >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< char_type, _Traits, _Alloc >::assign(initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'basic_string< value_type >::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'basic_string< value_type >::assign(basic_string &&__str) noexcept(allocator_traits< _Alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'basic_string< value_type >::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'basic_string< value_type >::assign(const value_type *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'basic_string< value_type >::assign(const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'basic_string< value_type >::assign(size_type __n, value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'basic_string< value_type >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'basic_string< value_type >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a65dabc6e005b7b5a19adf55792821e76',1,'deque< _StateSeqT >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ac0579ff04738a923ad49b8b9398af642',1,'deque< _StateSeqT >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ab16028e538ba034ad569b6933c152cdb',1,'deque< _StateSeqT >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a9f1a22c8bd2a8d5ecacab44644f513db',1,'list< __inp, __rebind_inp >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a6527fbbec76ab1a8a4a80c04e6fcac70',1,'list< __inp, __rebind_inp >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a396193b1480defeaa5f3367ca15ec35e',1,'list< __inp, __rebind_inp >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'match_results< _Bi_iter >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'match_results< _Bi_iter >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'match_results< _Bi_iter >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a4c13f179b615747c4870a009f84fb490',1,'std::basic_regex::assign(const basic_regex &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a2208605216a89f7c0a64b642ec56b962',1,'std::basic_regex::assign(basic_regex &&__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#ac2ebaaabe81e6b5b5d54bee16fdd494c',1,'std::basic_regex::assign(const _Ch_type *__p, flag_type __flags=ECMAScript)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a133cf9c18a76a5c5b69bb464ec68015f',1,'std::basic_regex::assign(const _Ch_type *__p, std::size_t __len, flag_type __flags)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a12b699dc147fc74d3882e6b661be3337',1,'std::basic_regex::assign(const basic_string< _Ch_type, _Ch_traits, _Alloc > &__s, flag_type __flags=ECMAScript)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#ac731050f58a6f3ec7fc94fd80139fb7e',1,'std::basic_regex::assign(_InputIterator __first, _InputIterator __last, flag_type __flags=ECMAScript)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a2856446d7ccd20e377e2904faadcd87e',1,'std::basic_regex::assign(initializer_list< _Ch_type > __l, flag_type __flags=ECMAScript)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a40c0c4216ddc30d2d77595a0af24e0a6',1,'std::basic_string::assign(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a745919f1f432a127a2373ce685bfe5a8',1,'std::basic_string::assign(basic_string &&__str) noexcept(allocator_traits< _Alloc >::is_always_equal::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af43d2cffe4cbafd3b7e0e3413a9d64e8',1,'std::basic_string::assign(const basic_string &__str, size_type __pos, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a29921ea06a2addf4f553a0926cee86ed',1,'std::basic_string::assign(const _CharT *__s, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1ce1e1a51bc5ac529889b64df32c8ab1',1,'std::basic_string::assign(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a057ebae0fb6e9ed0fa38c712cb059aeb',1,'std::basic_string::assign(size_type __n, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a56b07fb1cb32ec4e0d96d9ba1232579d',1,'std::basic_string::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a70293716cb2965eb975b5e7279373c5a',1,'std::basic_string::assign(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a65dabc6e005b7b5a19adf55792821e76',1,'std::deque::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ac0579ff04738a923ad49b8b9398af642',1,'std::deque::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ab16028e538ba034ad569b6933c152cdb',1,'std::deque::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aaf0bffb70955f72cf2972e70155e13d2',1,'std::forward_list::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a834314c2bf6e162dab99f07f1d6c551d',1,'std::forward_list::assign(size_type __n, const _Tp &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#adcaa8789d2741f6b65603b41c8aba63f',1,'std::forward_list::assign(std::initializer_list< _Tp > __il)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a9f1a22c8bd2a8d5ecacab44644f513db',1,'std::list::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a6527fbbec76ab1a8a4a80c04e6fcac70',1,'std::list::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a396193b1480defeaa5f3367ca15ec35e',1,'std::list::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'std::match_results::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'std::match_results::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'std::match_results::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'std::vector::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'std::vector::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'std::vector::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< __diff_type >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< __diff_type >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< __diff_type >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _CharClassT >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _CharClassT >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _CharClassT >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _CharT >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _CharT >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _CharT >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _Cmpt >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _Cmpt >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _Cmpt >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _Node *, _Nodeptr_Alloc >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _Node *, _Nodeptr_Alloc >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _Node *, _Nodeptr_Alloc >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _RealType >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _RealType >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _RealType >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _State< _TraitsT::char_type > >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _State< _TraitsT::char_type > >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _State< _TraitsT::char_type > >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< _StringT >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< _StringT >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< _StringT >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< block_type, allocator_type >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< block_type, allocator_type >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< block_type, allocator_type >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< Catalog_info * >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< Catalog_info * >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< Catalog_info * >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< double >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< double >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< double >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< int >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< int >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< int >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< result_type >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< result_type >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< result_type >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< size_t >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< size_t >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< size_t >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< std::pair< _BiIter, int > >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< std::pair< _BiIter, int > >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< std::pair< _BiIter, int > >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< std::pair< _StateIdT, std::vector > >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< std::pair< _StateIdT, std::vector > >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< std::pair< _StateIdT, std::vector > >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< std::pair< _StrTransT, _StrTransT > >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< std::pair< _StrTransT, _StrTransT > >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< std::pair< _StrTransT, _StrTransT > >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< sub_match< _Bi_iter >, _Alloc >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< sub_match< _Bi_iter >, _Alloc >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< sub_match< _Bi_iter >, _Alloc >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::assign(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a943d35baf02f390b9870351f0f78c1d7',1,'vector< sub_match< _BiIter >, _Alloc >::assign(size_type __n, const value_type &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acaab0c546279a999bcba3ed54478c83d',1,'vector< sub_match< _BiIter >, _Alloc >::assign(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#acda096d477c2ef09ee0b3e7fb3ca558c',1,'vector< sub_match< _BiIter >, _Alloc >::assign(initializer_list< value_type > __l)']]], + ['assign_5frow_668',['assign_row',['https://docs.opencv.org/4.2.0/d0/d06/namespacecv_1_1gapi_1_1own_1_1detail.html#ade6038d3a875aa1114b5ddeaaa696e79',1,'cv::gapi::own::detail']]], + ['assignto_669',['assignTo',['https://docs.opencv.org/4.2.0/d1/d0a/structcv_1_1cudev_1_1BinaryTransformPtrSz.html#a1c28e45877e56721c859a76c79652c71',1,'cv::cudev::BinaryTransformPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/dd/d49/structcv_1_1cudev_1_1CountNonZeroExprBody.html#ad465613d9f5946006ac34fb32613611e',1,'cv::cudev::CountNonZeroExprBody::assignTo()'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1cudev_1_1DerivXPtrSz.html#a3a9269d6dfcc69f51a3ed77ab1b3bedf',1,'cv::cudev::DerivXPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/d2/dfc/structcv_1_1cudev_1_1DerivYPtrSz.html#a993582f67a7d105f2b8bb5ac236a7cb8',1,'cv::cudev::DerivYPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/d9/d48/structcv_1_1cudev_1_1FindMaxValExprBody.html#acff08daea5a77493776db8cea26ec594',1,'cv::cudev::FindMaxValExprBody::assignTo()'],['https://docs.opencv.org/4.2.0/dd/db3/structcv_1_1cudev_1_1FindMinMaxValExprBody.html#a9d65da7120d96a494fdf01fa30c7d020',1,'cv::cudev::FindMinMaxValExprBody::assignTo()'],['https://docs.opencv.org/4.2.0/df/d82/structcv_1_1cudev_1_1FindMinValExprBody.html#a1b6d7c89f23af84b7621fbb403df1a2b',1,'cv::cudev::FindMinValExprBody::assignTo()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a03e76eb8993215020cff624ace66d7e6',1,'cv::cuda::GpuMat::assignTo()'],['https://docs.opencv.org/4.2.0/d9/dea/structcv_1_1cudev_1_1HistogramBody.html#af429d41ab0474d517c5befac92135df7',1,'cv::cudev::HistogramBody::assignTo()'],['https://docs.opencv.org/4.2.0/d3/dde/structcv_1_1cudev_1_1IntegralBody.html#a02c55aaaf7c505b578fcc3598a5d62ca',1,'cv::cudev::IntegralBody::assignTo()'],['https://docs.opencv.org/4.2.0/da/dd9/structcv_1_1cudev_1_1LaplacianPtrSz.html#ac0233702e954ba44e1ccc5d063241cc7',1,'cv::cudev::LaplacianPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/d5/d22/structcv_1_1cudev_1_1LutPtrSz.html#a6938b76f20af378a5328897b48f6cf5b',1,'cv::cudev::LutPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa8b3b4d7b9876a4726740b75daa98ddb',1,'cv::Mat::assignTo()'],['https://docs.opencv.org/4.2.0/d1/d8a/structcv_1_1cudev_1_1PyrDownBody.html#acba8f9bfb5e65d22fcee1630f949b903',1,'cv::cudev::PyrDownBody::assignTo()'],['https://docs.opencv.org/4.2.0/d1/de8/structcv_1_1cudev_1_1PyrUpBody.html#a550d44c816270ec4b39298c15b164d1e',1,'cv::cudev::PyrUpBody::assignTo()'],['https://docs.opencv.org/4.2.0/d5/df4/structcv_1_1cudev_1_1ReduceToColumnBody.html#a5968b92fd9324c04662ae4c924b5a1d8',1,'cv::cudev::ReduceToColumnBody::assignTo()'],['https://docs.opencv.org/4.2.0/da/d58/structcv_1_1cudev_1_1ReduceToRowBody.html#ad50d5168478eaa06984e8c13f59b0138',1,'cv::cudev::ReduceToRowBody::assignTo()'],['https://docs.opencv.org/4.2.0/dd/d03/structcv_1_1cudev_1_1RemapPtr1Sz.html#a68e72b778afc9b1bfebddb594e2f485f',1,'cv::cudev::RemapPtr1Sz::assignTo()'],['https://docs.opencv.org/4.2.0/d4/d59/structcv_1_1cudev_1_1RemapPtr2Sz.html#a3835cc862523a78e5fcb06fa3c2d3309',1,'cv::cudev::RemapPtr2Sz::assignTo()'],['https://docs.opencv.org/4.2.0/d3/d8a/structcv_1_1cudev_1_1ResizePtrSz.html#abe41fe80f4a491708011110e50a6fcb7',1,'cv::cudev::ResizePtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/d2/d88/structcv_1_1cudev_1_1ScharrXPtrSz.html#a142321c6f6267e273c2a2e25d12299d9',1,'cv::cudev::ScharrXPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/dd/def/structcv_1_1cudev_1_1ScharrYPtrSz.html#acbc7db67f57aaa5b4e2c439f184bb7c5',1,'cv::cudev::ScharrYPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1cudev_1_1SobelXPtrSz.html#a9eabceea8ece843309145bced287258e',1,'cv::cudev::SobelXPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/dd/dc6/structcv_1_1cudev_1_1SobelYPtrSz.html#ac3668092aa2a02fd0bfa3cd155fb39fc',1,'cv::cudev::SobelYPtrSz::assignTo()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ae102ac11f15a875d9b689575d585d21f',1,'cv::SparseMat::assignTo()'],['https://docs.opencv.org/4.2.0/dd/d33/structcv_1_1cudev_1_1SumExprBody.html#ad809e51dc955c25d4339229fd7e32345',1,'cv::cudev::SumExprBody::assignTo()'],['https://docs.opencv.org/4.2.0/d2/d40/structcv_1_1cudev_1_1TransposeBody.html#a14e6b573d82b37cff46690ee76bb7f07',1,'cv::cudev::TransposeBody::assignTo()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aef524a90c600f04e1cdd12788c608476',1,'cv::UMat::assignTo()'],['https://docs.opencv.org/4.2.0/d0/db7/structcv_1_1cudev_1_1UnaryTransformPtrSz.html#a7cb41f142cbf63b3101456c4762de6b3',1,'cv::cudev::UnaryTransformPtrSz::assignTo()']]], + ['assoc_5fcontainer_2ehpp_670',['assoc_container.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01115.html',1,'']]], + ['assoc_5flaguerre_671',['assoc_laguerre',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga377bb7e038c464a27dfe0573fd2d7b33',1,'std::assoc_laguerre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga41f206b7aaf85b07d45a66d68400a1a6',1,'std::tr1::assoc_laguerre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga377bb7e038c464a27dfe0573fd2d7b33',1,'assoc_laguerre(unsigned int __n, unsigned int __m, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga41f206b7aaf85b07d45a66d68400a1a6',1,'assoc_laguerre(unsigned int __n, unsigned int __m, _Tp __x)(Global Namespace)']]], + ['assoc_5flaguerref_672',['assoc_laguerref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf83d98f350a1cfcebee6a1f723cf90d2',1,'std::assoc_laguerref()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf83d98f350a1cfcebee6a1f723cf90d2',1,'assoc_laguerref()(Global Namespace)']]], + ['assoc_5flaguerrel_673',['assoc_laguerrel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gac8e245671fb2df5de5fd978d03081f6c',1,'std::assoc_laguerrel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gac8e245671fb2df5de5fd978d03081f6c',1,'assoc_laguerrel()(Global Namespace)']]], + ['assoc_5flegendre_674',['assoc_legendre',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga355349f79119c1fd1e2a9351cec57f0f',1,'std::assoc_legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga7cba5e4fcae2550e496bac5ce5347379',1,'std::tr1::assoc_legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga355349f79119c1fd1e2a9351cec57f0f',1,'assoc_legendre(unsigned int __l, unsigned int __m, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga7cba5e4fcae2550e496bac5ce5347379',1,'assoc_legendre(unsigned int __l, unsigned int __m, _Tp __x)(Global Namespace)']]], + ['assoc_5flegendref_675',['assoc_legendref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga3ced07ddd24bf4af56e2712d148e7f57',1,'std::assoc_legendref()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga3ced07ddd24bf4af56e2712d148e7f57',1,'assoc_legendref()(Global Namespace)']]], + ['assoc_5flegendrel_676',['assoc_legendrel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga55977b425a539146f060dec1c8003344',1,'std::assoc_legendrel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga55977b425a539146f060dec1c8003344',1,'assoc_legendrel(unsigned int __l, unsigned int __m, long double __x)(Global Namespace)']]], + ['associative_677',['Associative',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01471.html',1,'Associative'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01472.html',1,'Unordered Associative']]], + ['associative_5ftag_678',['associative_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11219.html',1,'__gnu_pbds']]], + ['assumption_20on_20stack_20alignment_679',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], + ['asymmetric_5fgrid_680',['ASYMMETRIC_GRID',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#ad83bbd88c4d01f670638e8ef4ffa6240a228f5c800931e5548a6eb45cd86cb0df',1,'cv::CirclesGridFinderParameters']]], + ['async_681',['async',['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#af0b613787bf7ad96ea630824bf042356',1,'cv::gapi::wip::async(GCompiled &gcmpld, std::function< void(std::exception_ptr)> &&callback, GRunArgs &&ins, GRunArgsP &&outs)'],['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#aef0be07fd8f46361642b6960846969c0',1,'cv::gapi::wip::async(GCompiled &gcmpld, std::function< void(std::exception_ptr)> &&callback, GRunArgs &&ins, GRunArgsP &&outs, GAsyncContext &ctx)'],['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#ac1e38f854b7b4820b9f82ebd51ba41a5',1,'cv::gapi::wip::async(GCompiled &gcmpld, GRunArgs &&ins, GRunArgsP &&outs)'],['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#adb9bd7fe80b6eee39f502c1185f902a4',1,'cv::gapi::wip::async(GCompiled &gcmpld, GRunArgs &&ins, GRunArgsP &&outs, GAsyncContext &ctx)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#gaf1fea595803dee7c5a4bc57bdcb433b5',1,'std::async(launch __policy, _Fn &&__fn, _Args &&... __args)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#gad8c32eea55b578ed51022e5607956064',1,'std::async(_Fn &&__fn, _Args &&... __args)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#gaf1fea595803dee7c5a4bc57bdcb433b5',1,'async(launch __policy, _Fn &&__fn, _Args &&... __args)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#gad8c32eea55b578ed51022e5607956064',1,'async(_Fn &&__fn, _Args &&... __args)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5ba0df93e34273b367bb63bad28c94c78d5',1,'async(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5ba0df93e34273b367bb63bad28c94c78d5',1,'async(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5ba0df93e34273b367bb63bad28c94c78d5',1,'async(Global Namespace)']]], + ['async_2ehpp_682',['async.hpp',['https://docs.opencv.org/4.2.0/d5/d2c/async_8hpp.html',1,'']]], + ['async_5fapply_683',['async_apply',['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#ac18191406996961abbc1f5060e08c510',1,'cv::gapi::wip::async_apply(GComputation &gcomp, std::function< void(std::exception_ptr)> &&callback, GRunArgs &&ins, GRunArgsP &&outs, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#af364608b2394086a446b58270d31024c',1,'cv::gapi::wip::async_apply(GComputation &gcomp, std::function< void(std::exception_ptr)> &&callback, GRunArgs &&ins, GRunArgsP &&outs, GCompileArgs &&args, GAsyncContext &ctx)'],['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#ad2b4cd2f672495907d53a395a17ec4c0',1,'cv::gapi::wip::async_apply(GComputation &gcomp, GRunArgs &&ins, GRunArgsP &&outs, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html#a134f0f0dbb68c447fbd23f32c1ec100a',1,'cv::gapi::wip::async_apply(GComputation &gcomp, GRunArgs &&ins, GRunArgsP &&outs, GCompileArgs &&args, GAsyncContext &ctx)']]], + ['async_5fcleanup_684',['ASYNC_CLEANUP',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12accd8af313f75caee034b5f3ed25027a5',1,'cv::UMatData']]], + ['async_5fpromise_2ehpp_685',['async_promise.hpp',['https://docs.opencv.org/4.2.0/d6/dc4/async__promise_8hpp.html',1,'']]], + ['asyncarray_686',['AsyncArray',['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html',1,'cv::AsyncArray'],['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#ab70c3efa65213c3a099d7fec44c4c8cc',1,'cv::AsyncArray::AsyncArray() CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a31c5119610da24ab47a4eb117b77e8f1',1,'cv::AsyncArray::AsyncArray(const AsyncArray &o) CV_NOEXCEPT']]], + ['asyncarray_3a_3aimpl_687',['Impl',['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#aa7ee836a29c724a5f017b2f3b86a5abb',1,'cv::AsyncPromise']]], + ['asyncenginecount_688',['asyncEngineCount',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ae6f4cce774f4b4516923f78a3baa1910',1,'cv::cuda::DeviceInfo']]], + ['asynchronous_20api_689',['Asynchronous API',['https://docs.opencv.org/4.2.0/da/d57/group__core__async.html',1,'']]], + ['asynchronous_20c_20c_20converters_690',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], + ['asyncpromise_691',['AsyncPromise',['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html',1,'cv::AsyncPromise'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#acc0b836ba3b79227de551dd9d874f25b',1,'cv::AsyncPromise::AsyncPromise() CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#a89de2a6edad184c21c0ae16a4d6662a4',1,'cv::AsyncPromise::AsyncPromise(const AsyncPromise &o) CV_NOEXCEPT']]], + ['asynctask_692',['AsyncTask',['../classutil_1_1AsyncTask.html',1,'util::AsyncTask< Clock >'],['../classutil_1_1AsyncTask.html#a82a2d21ca436f4b4e148267029f7f175',1,'util::AsyncTask::AsyncTask()']]], + ['asynctask_3c_20std_3a_3achrono_3a_3asteady_5fclock_20_3e_693',['AsyncTask< std::chrono::steady_clock >',['../classutil_1_1AsyncTask.html',1,'util']]], + ['at_694',['at',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa5d20fc86d41d59e4d71ae93daee9726',1,'cv::Mat::at(int i0=0)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a330d9adb78976b6efd4116c940924294',1,'cv::Mat::at(int i0=0) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ac40425b84f60b39fd35e03814122661f',1,'cv::Mat::at(int row, int col)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a5db6b18954e334048cb35752f49c6f8c',1,'cv::Mat::at(int row, int col) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a305829ed5c0ecfef7b44db18953048e8',1,'cv::Mat::at(int i0, int i1, int i2)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a59c6c2d9db1cfba76d75addeeb4e6a84',1,'cv::Mat::at(int i0, int i1, int i2) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a474bd5cdcf986672cfdc304f6be1cf64',1,'cv::Mat::at(const int *idx)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a2cbbb16670ae4d9aa747f19c24305213',1,'cv::Mat::at(const int *idx) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a9ec1aadc17ab8c8f8334d521719c7732',1,'cv::Mat::at(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a15c649a94cf2e06240b32b025231301f',1,'cv::Mat::at(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a23cd599a27c59bae64b0c40ad645ea49',1,'cv::Mat::at(Point pt)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a87d0b2e01b0f8686957398ecfb168a6d',1,'cv::Mat::at(Point pt) const'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#ab78352fac82e9c22e0f8b3964ada27ca',1,'NCVMatrix::at()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a1dbcd4e782ab5ac789de302889097f4d',1,'__gnu_cxx::__versa_string::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a918448764b4f015d1ef5823415115db0',1,'__gnu_cxx::__versa_string::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'__gnu_debug::basic_string::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'__gnu_debug::basic_string::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< _CharT >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< _CharT >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< _CharT, _Traits, _Allocator >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< _CharT, _Traits, _Allocator >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< char >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< char >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< char, char_traits< char >, _Byte_alloc >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< char_type, _Traits, _Alloc >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< char_type, _Traits, _Alloc >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'basic_string< value_type >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'basic_string< value_type >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a4b0080ca0ed1a2222104a5fb776a454f',1,'deque< _StateSeqT >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a03a10b684468f787e852fa360440ba7b',1,'deque< _StateSeqT >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'match_results< _Bi_iter >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'match_results< _Bi_iter >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7b3f71d659cec45cc094e220814402e6',1,'std::basic_string::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#afb57639cf518335a43c9b2875438fe0d',1,'std::basic_string::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a4b0080ca0ed1a2222104a5fb776a454f',1,'std::deque::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a03a10b684468f787e852fa360440ba7b',1,'std::deque::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#aaf4942bb42ef39ce49cc232c06416f55',1,'std::map::at()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'std::match_results::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'std::match_results::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a801392267ec716837238015f8cefe60a',1,'std::unordered_map::at(const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a1f78ebfeb9bf55bc807a075eb22cb2aa',1,'std::unordered_map::at(const key_type &__k) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a801392267ec716837238015f8cefe60a',1,'std::unordered_map::at(const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a1f78ebfeb9bf55bc807a075eb22cb2aa',1,'std::unordered_map::at(const key_type &__k) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'std::vector::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'std::vector::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a801392267ec716837238015f8cefe60a',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::at(const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a1f78ebfeb9bf55bc807a075eb22cb2aa',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::at(const key_type &__k) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a801392267ec716837238015f8cefe60a',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::at(const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a1f78ebfeb9bf55bc807a075eb22cb2aa',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::at(const key_type &__k) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< __diff_type >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< __diff_type >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _CharClassT >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _CharClassT >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _CharT >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _CharT >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _Cmpt >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _Cmpt >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _Node *, _Nodeptr_Alloc >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _Node *, _Nodeptr_Alloc >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _RealType >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _RealType >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _State< _TraitsT::char_type > >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _State< _TraitsT::char_type > >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< _StringT >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< _StringT >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< block_type, allocator_type >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< block_type, allocator_type >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< Catalog_info * >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< Catalog_info * >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< double >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< double >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< int >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< int >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< result_type >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< result_type >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< size_t >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< size_t >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< std::pair< _BiIter, int > >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< std::pair< _BiIter, int > >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< std::pair< _StateIdT, std::vector > >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< std::pair< _StateIdT, std::vector > >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< std::pair< _StrTransT, _StrTransT > >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< std::pair< _StrTransT, _StrTransT > >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< sub_match< _Bi_iter >, _Alloc >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< sub_match< _Bi_iter >, _Alloc >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::at(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a11362894b61f87331541b5268d0cb033',1,'vector< sub_match< _BiIter >, _Alloc >::at(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aaa0004f67abf317a8923d549a0e74987',1,'vector< sub_match< _BiIter >, _Alloc >::at(size_type __n) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a52b18a5b7e68652c65b070900c438c6e.html#a52b18a5b7e68652c65b070900c438c6e',1,'nlohmann::basic_json::at(size_type idx)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aeb18fe2b8a5dbff4ccf2848de854c3ac.html#aeb18fe2b8a5dbff4ccf2848de854c3ac',1,'nlohmann::basic_json::at(size_type idx) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a239e942da82f2597d0cf5ec806f5bc0d.html#a239e942da82f2597d0cf5ec806f5bc0d',1,'nlohmann::basic_json::at(const typename object_t::key_type &key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a229964ee10c92ba89ae4fba786fe6b50.html#a229964ee10c92ba89ae4fba786fe6b50',1,'nlohmann::basic_json::at(const typename object_t::key_type &key) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa014a978f8b6c085db8825faa8dad320.html#aa014a978f8b6c085db8825faa8dad320',1,'nlohmann::basic_json::at(const json_pointer &ptr)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a8284b9c1d4d0830151eaa000f907b2e6.html#a8284b9c1d4d0830151eaa000f907b2e6',1,'nlohmann::basic_json::at(const json_pointer &ptr) const'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_ab7b4bb185fe7ea84f8f5f32fd230ff91.html#ab7b4bb185fe7ea84f8f5f32fd230ff91',1,'nlohmann::ordered_map::at(const Key &key)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a8b7f27215180385b9b1e98adc4dd8ae7.html#a8b7f27215180385b9b1e98adc4dd8ae7',1,'nlohmann::ordered_map::at(const Key &key) const'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga64715f89ad837e2b6b5649d0f833172d',1,'cv::videostab::at(int idx, std::vector< T > &items)'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga45b7337858133cf230ad65a10c9ea63e',1,'cv::videostab::at(int idx, const std::vector< T > &items)'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga64715f89ad837e2b6b5649d0f833172d',1,'at(int idx, std::vector< T > &items)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga45b7337858133cf230ad65a10c9ea63e',1,'at(int idx, const std::vector< T > &items)(Global Namespace)']]], + ['atan_695',['atan',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76519038c10b0850b3cde04510e47628',1,'cv::cudev::atan(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab95a1eb1e568567f99a4a80c017543b',1,'cv::cudev::atan(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ff6e6613aa330d6879859b60fa249a9',1,'cv::cudev::atan(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3c05d20d386b1322b5113843962724d',1,'cv::cudev::atan(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6c4640461ed5be47b854d04c06a8e63',1,'cv::cudev::atan(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab727395d294da3a0dfb9bf9451f6b2ae',1,'cv::cudev::atan(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d35ea6aca3e67a1662eba95eda3fa8b',1,'cv::cudev::atan(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41ae7f410575919bd4ce075352044af7',1,'cv::cudev::atan(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40321639c1c78a1660232f1430ac5566',1,'cv::cudev::atan(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b5d932a4a1bb008ae867523a1bd74a7',1,'cv::cudev::atan(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76211c2027a8aa7e4155c3210425c95b',1,'cv::cudev::atan(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fc1bb772d4564dac7cd7cb0ed7df80b',1,'cv::cudev::atan(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d0c7779cc0f9a79c8073e1437d2e8e',1,'cv::cudev::atan(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab00d9dea034bf8677416f744f0f66ff4',1,'cv::cudev::atan(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad23653a760d85e4d8bbfa5745b87d46a',1,'cv::cudev::atan(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0517db8af089b0e0944a19ecf4dd8f9b',1,'cv::cudev::atan(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3501efbd5341dd76dfc3633e10c28ee',1,'cv::cudev::atan(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1e91e4112660c333cfa90c58360478',1,'cv::cudev::atan(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51ea14361d01f1cca9588d87b9c487d5',1,'cv::cudev::atan(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9729dd146f91a4831ae5971c04d2f328',1,'cv::cudev::atan(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59a7fb808c81f36c252aaf0fc670dd8d',1,'cv::cudev::atan(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46222230f712764b0453592e00047cb3',1,'cv::cudev::atan(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2aa924c2d92a1be4a0ab61bda786581',1,'cv::cudev::atan(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9a1c3324e3d1a3a3cec0bd83a9e6a86',1,'cv::cudev::atan(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3607a419266b05a79ab00353e65318e',1,'cv::cudev::atan(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1bb215c5a0b941c71a6d1cc86aac551',1,'cv::cudev::atan(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8aa2780e4680f5b6358b01d29295895a',1,'cv::cudev::atan(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d997e44717ac71efa7a9b7e77e7d2df',1,'cv::cudev::atan(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e8f4f3559282fe3b89bdc96ba0692e5',1,'cv::cudev::atan(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga811d7f5c5a8f51ed2d349a4fa5a89cd2',1,'cv::cudev::atan(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b4df626e0a9d9300ef730c13efbea26',1,'cv::cudev::atan(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98d2b1c113e5bbb8f87a28c4af40eac',1,'cv::cudev::atan(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76519038c10b0850b3cde04510e47628',1,'atan(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab95a1eb1e568567f99a4a80c017543b',1,'atan(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ff6e6613aa330d6879859b60fa249a9',1,'atan(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3c05d20d386b1322b5113843962724d',1,'atan(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6c4640461ed5be47b854d04c06a8e63',1,'atan(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab727395d294da3a0dfb9bf9451f6b2ae',1,'atan(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d35ea6aca3e67a1662eba95eda3fa8b',1,'atan(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41ae7f410575919bd4ce075352044af7',1,'atan(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40321639c1c78a1660232f1430ac5566',1,'atan(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b5d932a4a1bb008ae867523a1bd74a7',1,'atan(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76211c2027a8aa7e4155c3210425c95b',1,'atan(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fc1bb772d4564dac7cd7cb0ed7df80b',1,'atan(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d0c7779cc0f9a79c8073e1437d2e8e',1,'atan(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab00d9dea034bf8677416f744f0f66ff4',1,'atan(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad23653a760d85e4d8bbfa5745b87d46a',1,'atan(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0517db8af089b0e0944a19ecf4dd8f9b',1,'atan(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3501efbd5341dd76dfc3633e10c28ee',1,'atan(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1e91e4112660c333cfa90c58360478',1,'atan(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51ea14361d01f1cca9588d87b9c487d5',1,'atan(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9729dd146f91a4831ae5971c04d2f328',1,'atan(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59a7fb808c81f36c252aaf0fc670dd8d',1,'atan(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46222230f712764b0453592e00047cb3',1,'atan(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2aa924c2d92a1be4a0ab61bda786581',1,'atan(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9a1c3324e3d1a3a3cec0bd83a9e6a86',1,'atan(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3607a419266b05a79ab00353e65318e',1,'atan(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1bb215c5a0b941c71a6d1cc86aac551',1,'atan(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8aa2780e4680f5b6358b01d29295895a',1,'atan(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d997e44717ac71efa7a9b7e77e7d2df',1,'atan(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e8f4f3559282fe3b89bdc96ba0692e5',1,'atan(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga811d7f5c5a8f51ed2d349a4fa5a89cd2',1,'atan(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b4df626e0a9d9300ef730c13efbea26',1,'atan(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98d2b1c113e5bbb8f87a28c4af40eac',1,'atan(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a217a638ff609e744f9e5f5cf2837ec7c',1,'std::atan()'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a230744e17147d12e8ef3f2fc3796f64f',1,'Eigen::atan()']]], + ['atan_20calculation_696',['Atan calculation',['https://docs.opencv.org/4.2.0/d5/df4/group__core__hal__interface__fastAtan.html',1,'']]], + ['atan2_697',['atan2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1096ba687de70142e095cc791a8bcd65',1,'cv::cudev::atan2(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea17b004f2795d20b4a18042e99cbe07',1,'cv::cudev::atan2(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38a8c0dee5b828bd4bf6b8e7b46aa41d',1,'cv::cudev::atan2(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5a591894baa3eaf268fca9517b5119a',1,'cv::cudev::atan2(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46bfc86035dacd64b560e99228c07659',1,'cv::cudev::atan2(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf1a00440a0655c709cbd058716dd807',1,'cv::cudev::atan2(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49249a904bcbd03315115523af2396dd',1,'cv::cudev::atan2(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab861201447e7162e4a3783b5f51f2693',1,'cv::cudev::atan2(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9d3f511bf50dbd49eec6850dae931d6',1,'cv::cudev::atan2(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffd1e00289cb8d7c385a46a9399980c8',1,'cv::cudev::atan2(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab8bb7aba60c1d1b27978224cdb9df46',1,'cv::cudev::atan2(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e25e169d4b48f3684ac6033aab4467',1,'cv::cudev::atan2(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c12d43e2d8844a8bd757a0657a957b0',1,'cv::cudev::atan2(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed6f62d280746b5f504baa73ca8ed94',1,'cv::cudev::atan2(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157278f9faa761d2e34742ac26feeba4',1,'cv::cudev::atan2(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a77cd66704f8b0304cf769265e92fd5',1,'cv::cudev::atan2(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga745ff9d16168da5a7e298a2884a2aa83',1,'cv::cudev::atan2(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedc94b60c53bdd7dc5787a4e3d2e3a67',1,'cv::cudev::atan2(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44afd9cc0895caad98d1f98a77312de5',1,'cv::cudev::atan2(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f04f13e6001cac0be9cfeb61eeede4',1,'cv::cudev::atan2(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72659c64e6cd237e021a4957a4cee1b3',1,'cv::cudev::atan2(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3852f8a17d8f6fa5e508bc28acbf0ce',1,'cv::cudev::atan2(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e025ebc2f035ad65889d5652de96418',1,'cv::cudev::atan2(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa05dc5c9ddafb2bf3fe520bfe6437192',1,'cv::cudev::atan2(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e2d5e75d8a97349bfb41580e96b85dd',1,'cv::cudev::atan2(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d446715ec6432710cd53df3a27b2316',1,'cv::cudev::atan2(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85af58eb64bf1ae4cefd537619ec19bc',1,'cv::cudev::atan2(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93b3ad15464f549ebdd36ddc81c9bbde',1,'cv::cudev::atan2(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1719afb3423f877a90420e612b2a396',1,'cv::cudev::atan2(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b5ed200d1c1e7501c8a57b28c397d8b',1,'cv::cudev::atan2(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2af08219909de2e495e5dc3cd4a4837',1,'cv::cudev::atan2(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8d59c83e777636c7925105df14c43aa',1,'cv::cudev::atan2(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14ae533174c29f63b05b28a464dcdb0d',1,'cv::cudev::atan2(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60ed8ac4c9488179d768ede2ae159aff',1,'cv::cudev::atan2(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade8d766f68176ee3c197ba84b6add309',1,'cv::cudev::atan2(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc569183987aebd097dca26c293acf42',1,'cv::cudev::atan2(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d15bc12afaa97b73bc36f090c3058a4',1,'cv::cudev::atan2(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10e80a60e87509d67a16119a1a2ef215',1,'cv::cudev::atan2(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bdac88fad1b9935c35846d11f45b2f0',1,'cv::cudev::atan2(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga428417d9a9544f7256cef41b45ee85e0',1,'cv::cudev::atan2(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad4b704a40a60ce10160a4943041e2bb2',1,'cv::cudev::atan2(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd889240f8061747157ad751f8e8f01c',1,'cv::cudev::atan2(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga898aac014a0621131a0165b676755c7e',1,'cv::cudev::atan2(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0f5b4cb305a5cb141a374196a20f2b1',1,'cv::cudev::atan2(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada1efc2397252353284a743b9c070b4a',1,'cv::cudev::atan2(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d555044c48f10358a37362162d8af74',1,'cv::cudev::atan2(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36e4bb9f83dff6d168bcf6209f6dcf09',1,'cv::cudev::atan2(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa46979c44658d86f3357c21cba39b19f',1,'cv::cudev::atan2(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ef505d94d762872016cca9ec9f038a4',1,'cv::cudev::atan2(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad66b780d981442b462a3a18433e72d89',1,'cv::cudev::atan2(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9875261d377a22cb1cd8dd54df1b0c69',1,'cv::cudev::atan2(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31f93a8102d8a87db718bee8d3a61f3b',1,'cv::cudev::atan2(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ec7ffd33f29602103880fe8c01a9be5',1,'cv::cudev::atan2(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0111ffb3ef709cb3104909e489f95612',1,'cv::cudev::atan2(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga038366eaf3ea6431b8e6b5aee81e3b55',1,'cv::cudev::atan2(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga361e3513fe073e25fb1b30f30fff6343',1,'cv::cudev::atan2(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac30587655a3518b8080f4ac8f8f1a476',1,'cv::cudev::atan2(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga743bf1f058844e2f530be6b7640df1ab',1,'cv::cudev::atan2(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8080066cfee1055c098b44aca247c618',1,'cv::cudev::atan2(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6e266434cdcdc755bcfd6011beaf20f',1,'cv::cudev::atan2(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72461ef3d9a8d2e9757d08322c6961eb',1,'cv::cudev::atan2(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8828e7d633aab4c05f76f06216eb87c',1,'cv::cudev::atan2(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3123f7d63f0af6eb48dc102bf3ea4075',1,'cv::cudev::atan2(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ca7447aaf315124dd45d48c174d7c40',1,'cv::cudev::atan2(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b4bc4eb319b732a2baecc61d63f13d4',1,'cv::cudev::atan2(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f756ad7d2032f03f630a54d90825c0b',1,'cv::cudev::atan2(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae911b89ee2c2ce3fdad14200fa2a9392',1,'cv::cudev::atan2(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5504995a857dfa9231c8977ff2937dbe',1,'cv::cudev::atan2(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1adb312f5eefae17c11e654af632f6f7',1,'cv::cudev::atan2(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf128364ff1eb079a996bf6c4c8088917',1,'cv::cudev::atan2(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac01aecde5aac39ecbf6d8949f617fa81',1,'cv::cudev::atan2(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b942442fe1810dec67f4462dc5378e2',1,'cv::cudev::atan2(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16f74e9b699a44244e2de3c8ce7789ae',1,'cv::cudev::atan2(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56ef7a3cbbc7c66a48cf2de3e1bfc663',1,'cv::cudev::atan2(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4986df7c60cf5447e5eef4119227ccec',1,'cv::cudev::atan2(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafae1146f0520c4f1fc651d375ae9096e',1,'cv::cudev::atan2(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93233ff0b98013933ac07b4f5bb681c0',1,'cv::cudev::atan2(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76c799b57e64800230dd2060166a0d79',1,'cv::cudev::atan2(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b5f58036e964305abed793e9a1a0ab1',1,'cv::cudev::atan2(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcc428567f7868d81d7bed41a0d0db8a',1,'cv::cudev::atan2(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d4f255a1c9af270f5693e635c21b18e',1,'cv::cudev::atan2(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b0cb3a9ee9d6677dac546bf8b843251',1,'cv::cudev::atan2(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga885d50ba15deab10fab2beee8b480284',1,'cv::cudev::atan2(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f0c49f8a139ff8fc488b0b55ffedd81',1,'cv::cudev::atan2(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga381b37fe99c30d394ff60e8cdafceabc',1,'cv::cudev::atan2(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b50464bf014bfda723275f36f555424',1,'cv::cudev::atan2(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a1bcf68ac7d55c10e66bb68dc349557',1,'cv::cudev::atan2(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45fc71867baf50b3d75d57f437f89855',1,'cv::cudev::atan2(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga149b1802d88b8d90fa096da5b22034d8',1,'cv::cudev::atan2(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c327bb8321737f387da3ebf8da4f8e',1,'cv::cudev::atan2(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42256de3419110d8f1dd6c2d41bfe95',1,'cv::cudev::atan2(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga632ccaeae520dd63d5dcdd24c4b11143',1,'cv::cudev::atan2(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64a947ee9a3203c8f4c6bcbe99aedd16',1,'cv::cudev::atan2(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafea32ad9f9d1956b3b4724f4a4e76f97',1,'cv::cudev::atan2(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83a6f6d9ef686f9da3e473c8b94942fb',1,'cv::cudev::atan2(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3229276a7717fd211701120aaea64686',1,'cv::cudev::atan2(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7a1b4d7dbe10e19e19b2132f481d32a',1,'cv::cudev::atan2(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f72dd25ac836e50fd5b8e29b0a9e571',1,'cv::cudev::atan2(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga999171de7b45ae8d8a853f91e21cd395',1,'cv::cudev::atan2(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad4d2b2d41cdead9aabb34c273e1790dd',1,'cv::cudev::atan2(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59092bcc2cd2b683aa084b2bf86d8b8a',1,'cv::cudev::atan2(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49886e9c8f41624cb677886161a09e7a',1,'cv::cudev::atan2(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade1229e1aaa5a65a27162d10459cbd58',1,'cv::cudev::atan2(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e1a275293d52e75b6af41e3ed881194',1,'cv::cudev::atan2(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90abcedc1ca539ab2568c0e619426554',1,'cv::cudev::atan2(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecf3ce6295f95abdedf4a6177436c7a6',1,'cv::cudev::atan2(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8add44a50a911f32acba7f92e26a6cbd',1,'cv::cudev::atan2(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga002ad28c53028348b2b305aa65cf9d50',1,'cv::cudev::atan2(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3f9eff403a87a4808e58a55cefc0190',1,'cv::cudev::atan2(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b941c726171e23bf62c9977f097be50',1,'cv::cudev::atan2(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e536463d5526cd0759a5c885390d92e',1,'cv::cudev::atan2(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17cbb896cbfb8ea94b1409c2b37d9841',1,'cv::cudev::atan2(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15c31be946b78e4f80c491e9a17ff355',1,'cv::cudev::atan2(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aacbc5481ecfd9ad46722f2c7446ef4',1,'cv::cudev::atan2(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f1b98c16d106dfe3c3a304a7fb210fa',1,'cv::cudev::atan2(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d6e6c568b94218d8210bf11fe53c1e5',1,'cv::cudev::atan2(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5321c1e5ac530fda3a9475f67e0b3c98',1,'cv::cudev::atan2(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d5de286c458b9d0632bd71db7fa1783',1,'cv::cudev::atan2(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10f535124b8eadaf5dd0eb0c1cc619e0',1,'cv::cudev::atan2(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga994eac52fbaf9297dc990e027b61e44e',1,'cv::cudev::atan2(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41147256ef9f2894db35a83d18b3a822',1,'cv::cudev::atan2(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f3c1d10be53413916d71ff534e1ca8',1,'cv::cudev::atan2(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa83474d84ca53984187bdb2f85105e49',1,'cv::cudev::atan2(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga944b337b1290763bc823038188accab5',1,'cv::cudev::atan2(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9841bb4972928899b85bd903b9464b67',1,'cv::cudev::atan2(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b17d79dfac624311a9b19fa71fb9d32',1,'cv::cudev::atan2(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a835bb2b2cd1a2c47220d30c25c82c',1,'cv::cudev::atan2(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22374d1d47455e5ce8b45ef643c96786',1,'cv::cudev::atan2(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6fa1b5df2963cb0a8af7e0ee7cd87da',1,'cv::cudev::atan2(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea4a92f90ab1d184e271bcaa990ea260',1,'cv::cudev::atan2(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11770948c91fb9ae23e4d725b1485cc9',1,'cv::cudev::atan2(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa047916438b9b7c2b4cdbee8b62f1a7',1,'cv::cudev::atan2(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3630688c8119479632fbd4e541704ce2',1,'cv::cudev::atan2(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fece86f51df2f39ad090f8c863cbf75',1,'cv::cudev::atan2(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91a027876b30256165fc260eeef0ab5a',1,'cv::cudev::atan2(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa606210bf9ec7f9c8d43479345a56218',1,'cv::cudev::atan2(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga578ce83bb6c23773c6a7f3fe2098e40e',1,'cv::cudev::atan2(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d4546c30571db43534c080307ecd69d',1,'cv::cudev::atan2(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf23c3d564a07e98d30fbd0dcc2c564d',1,'cv::cudev::atan2(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9b655db78fcadb8131efc748e313044',1,'cv::cudev::atan2(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga646720fd65e8a68f28a85b236d4488d8',1,'cv::cudev::atan2(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe53a1f07b61f41c5f05c260ebb5d802',1,'cv::cudev::atan2(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac622474b43607e3f8cb0d8b501da2d45',1,'cv::cudev::atan2(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34afbf365de9a2cc23c22c349c0ffc99',1,'cv::cudev::atan2(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga945b9594aa8568ed90f930a246b8546c',1,'cv::cudev::atan2(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga479500e51eacd0650c2b7fd3134dfe6f',1,'cv::cudev::atan2(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga911eecb5f18a765751dbbf2e3b749505',1,'cv::cudev::atan2(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga551fdabe03747f18117c610707984c53',1,'cv::cudev::atan2(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedb4907088a6e72095a82667ec0dae3d',1,'cv::cudev::atan2(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e9557a4ab8f934e83942b629ffdba51',1,'cv::cudev::atan2(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55aae8c51913a949a9a5926e63f44776',1,'cv::cudev::atan2(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga634f63841368060113764d5d3fd4f5fd',1,'cv::cudev::atan2(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1096ba687de70142e095cc791a8bcd65',1,'atan2(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea17b004f2795d20b4a18042e99cbe07',1,'atan2(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38a8c0dee5b828bd4bf6b8e7b46aa41d',1,'atan2(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5a591894baa3eaf268fca9517b5119a',1,'atan2(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46bfc86035dacd64b560e99228c07659',1,'atan2(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf1a00440a0655c709cbd058716dd807',1,'atan2(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49249a904bcbd03315115523af2396dd',1,'atan2(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab861201447e7162e4a3783b5f51f2693',1,'atan2(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9d3f511bf50dbd49eec6850dae931d6',1,'atan2(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffd1e00289cb8d7c385a46a9399980c8',1,'atan2(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab8bb7aba60c1d1b27978224cdb9df46',1,'atan2(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e25e169d4b48f3684ac6033aab4467',1,'atan2(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c12d43e2d8844a8bd757a0657a957b0',1,'atan2(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed6f62d280746b5f504baa73ca8ed94',1,'atan2(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157278f9faa761d2e34742ac26feeba4',1,'atan2(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a77cd66704f8b0304cf769265e92fd5',1,'atan2(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga745ff9d16168da5a7e298a2884a2aa83',1,'atan2(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedc94b60c53bdd7dc5787a4e3d2e3a67',1,'atan2(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44afd9cc0895caad98d1f98a77312de5',1,'atan2(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f04f13e6001cac0be9cfeb61eeede4',1,'atan2(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72659c64e6cd237e021a4957a4cee1b3',1,'atan2(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3852f8a17d8f6fa5e508bc28acbf0ce',1,'atan2(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e025ebc2f035ad65889d5652de96418',1,'atan2(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa05dc5c9ddafb2bf3fe520bfe6437192',1,'atan2(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e2d5e75d8a97349bfb41580e96b85dd',1,'atan2(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d446715ec6432710cd53df3a27b2316',1,'atan2(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85af58eb64bf1ae4cefd537619ec19bc',1,'atan2(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93b3ad15464f549ebdd36ddc81c9bbde',1,'atan2(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1719afb3423f877a90420e612b2a396',1,'atan2(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b5ed200d1c1e7501c8a57b28c397d8b',1,'atan2(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2af08219909de2e495e5dc3cd4a4837',1,'atan2(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8d59c83e777636c7925105df14c43aa',1,'atan2(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14ae533174c29f63b05b28a464dcdb0d',1,'atan2(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60ed8ac4c9488179d768ede2ae159aff',1,'atan2(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade8d766f68176ee3c197ba84b6add309',1,'atan2(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc569183987aebd097dca26c293acf42',1,'atan2(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d15bc12afaa97b73bc36f090c3058a4',1,'atan2(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10e80a60e87509d67a16119a1a2ef215',1,'atan2(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bdac88fad1b9935c35846d11f45b2f0',1,'atan2(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga428417d9a9544f7256cef41b45ee85e0',1,'atan2(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad4b704a40a60ce10160a4943041e2bb2',1,'atan2(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd889240f8061747157ad751f8e8f01c',1,'atan2(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga898aac014a0621131a0165b676755c7e',1,'atan2(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0f5b4cb305a5cb141a374196a20f2b1',1,'atan2(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada1efc2397252353284a743b9c070b4a',1,'atan2(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d555044c48f10358a37362162d8af74',1,'atan2(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36e4bb9f83dff6d168bcf6209f6dcf09',1,'atan2(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa46979c44658d86f3357c21cba39b19f',1,'atan2(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ef505d94d762872016cca9ec9f038a4',1,'atan2(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad66b780d981442b462a3a18433e72d89',1,'atan2(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9875261d377a22cb1cd8dd54df1b0c69',1,'atan2(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31f93a8102d8a87db718bee8d3a61f3b',1,'atan2(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ec7ffd33f29602103880fe8c01a9be5',1,'atan2(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0111ffb3ef709cb3104909e489f95612',1,'atan2(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga038366eaf3ea6431b8e6b5aee81e3b55',1,'atan2(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga361e3513fe073e25fb1b30f30fff6343',1,'atan2(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac30587655a3518b8080f4ac8f8f1a476',1,'atan2(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga743bf1f058844e2f530be6b7640df1ab',1,'atan2(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8080066cfee1055c098b44aca247c618',1,'atan2(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6e266434cdcdc755bcfd6011beaf20f',1,'atan2(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72461ef3d9a8d2e9757d08322c6961eb',1,'atan2(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8828e7d633aab4c05f76f06216eb87c',1,'atan2(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3123f7d63f0af6eb48dc102bf3ea4075',1,'atan2(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ca7447aaf315124dd45d48c174d7c40',1,'atan2(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b4bc4eb319b732a2baecc61d63f13d4',1,'atan2(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f756ad7d2032f03f630a54d90825c0b',1,'atan2(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae911b89ee2c2ce3fdad14200fa2a9392',1,'atan2(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5504995a857dfa9231c8977ff2937dbe',1,'atan2(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1adb312f5eefae17c11e654af632f6f7',1,'atan2(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf128364ff1eb079a996bf6c4c8088917',1,'atan2(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac01aecde5aac39ecbf6d8949f617fa81',1,'atan2(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b942442fe1810dec67f4462dc5378e2',1,'atan2(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16f74e9b699a44244e2de3c8ce7789ae',1,'atan2(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56ef7a3cbbc7c66a48cf2de3e1bfc663',1,'atan2(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4986df7c60cf5447e5eef4119227ccec',1,'atan2(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafae1146f0520c4f1fc651d375ae9096e',1,'atan2(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93233ff0b98013933ac07b4f5bb681c0',1,'atan2(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76c799b57e64800230dd2060166a0d79',1,'atan2(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b5f58036e964305abed793e9a1a0ab1',1,'atan2(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcc428567f7868d81d7bed41a0d0db8a',1,'atan2(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d4f255a1c9af270f5693e635c21b18e',1,'atan2(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b0cb3a9ee9d6677dac546bf8b843251',1,'atan2(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga885d50ba15deab10fab2beee8b480284',1,'atan2(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f0c49f8a139ff8fc488b0b55ffedd81',1,'atan2(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga381b37fe99c30d394ff60e8cdafceabc',1,'atan2(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b50464bf014bfda723275f36f555424',1,'atan2(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a1bcf68ac7d55c10e66bb68dc349557',1,'atan2(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45fc71867baf50b3d75d57f437f89855',1,'atan2(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga149b1802d88b8d90fa096da5b22034d8',1,'atan2(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c327bb8321737f387da3ebf8da4f8e',1,'atan2(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42256de3419110d8f1dd6c2d41bfe95',1,'atan2(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga632ccaeae520dd63d5dcdd24c4b11143',1,'atan2(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64a947ee9a3203c8f4c6bcbe99aedd16',1,'atan2(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafea32ad9f9d1956b3b4724f4a4e76f97',1,'atan2(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83a6f6d9ef686f9da3e473c8b94942fb',1,'atan2(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3229276a7717fd211701120aaea64686',1,'atan2(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7a1b4d7dbe10e19e19b2132f481d32a',1,'atan2(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f72dd25ac836e50fd5b8e29b0a9e571',1,'atan2(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga999171de7b45ae8d8a853f91e21cd395',1,'atan2(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad4d2b2d41cdead9aabb34c273e1790dd',1,'atan2(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59092bcc2cd2b683aa084b2bf86d8b8a',1,'atan2(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49886e9c8f41624cb677886161a09e7a',1,'atan2(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade1229e1aaa5a65a27162d10459cbd58',1,'atan2(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e1a275293d52e75b6af41e3ed881194',1,'atan2(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90abcedc1ca539ab2568c0e619426554',1,'atan2(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecf3ce6295f95abdedf4a6177436c7a6',1,'atan2(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8add44a50a911f32acba7f92e26a6cbd',1,'atan2(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga002ad28c53028348b2b305aa65cf9d50',1,'atan2(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3f9eff403a87a4808e58a55cefc0190',1,'atan2(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b941c726171e23bf62c9977f097be50',1,'atan2(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e536463d5526cd0759a5c885390d92e',1,'atan2(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17cbb896cbfb8ea94b1409c2b37d9841',1,'atan2(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15c31be946b78e4f80c491e9a17ff355',1,'atan2(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aacbc5481ecfd9ad46722f2c7446ef4',1,'atan2(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f1b98c16d106dfe3c3a304a7fb210fa',1,'atan2(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d6e6c568b94218d8210bf11fe53c1e5',1,'atan2(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5321c1e5ac530fda3a9475f67e0b3c98',1,'atan2(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d5de286c458b9d0632bd71db7fa1783',1,'atan2(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10f535124b8eadaf5dd0eb0c1cc619e0',1,'atan2(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga994eac52fbaf9297dc990e027b61e44e',1,'atan2(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41147256ef9f2894db35a83d18b3a822',1,'atan2(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f3c1d10be53413916d71ff534e1ca8',1,'atan2(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa83474d84ca53984187bdb2f85105e49',1,'atan2(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga944b337b1290763bc823038188accab5',1,'atan2(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9841bb4972928899b85bd903b9464b67',1,'atan2(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b17d79dfac624311a9b19fa71fb9d32',1,'atan2(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a835bb2b2cd1a2c47220d30c25c82c',1,'atan2(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22374d1d47455e5ce8b45ef643c96786',1,'atan2(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6fa1b5df2963cb0a8af7e0ee7cd87da',1,'atan2(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea4a92f90ab1d184e271bcaa990ea260',1,'atan2(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11770948c91fb9ae23e4d725b1485cc9',1,'atan2(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa047916438b9b7c2b4cdbee8b62f1a7',1,'atan2(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3630688c8119479632fbd4e541704ce2',1,'atan2(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fece86f51df2f39ad090f8c863cbf75',1,'atan2(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91a027876b30256165fc260eeef0ab5a',1,'atan2(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa606210bf9ec7f9c8d43479345a56218',1,'atan2(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga578ce83bb6c23773c6a7f3fe2098e40e',1,'atan2(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d4546c30571db43534c080307ecd69d',1,'atan2(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf23c3d564a07e98d30fbd0dcc2c564d',1,'atan2(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9b655db78fcadb8131efc748e313044',1,'atan2(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga646720fd65e8a68f28a85b236d4488d8',1,'atan2(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe53a1f07b61f41c5f05c260ebb5d802',1,'atan2(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac622474b43607e3f8cb0d8b501da2d45',1,'atan2(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34afbf365de9a2cc23c22c349c0ffc99',1,'atan2(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga945b9594aa8568ed90f930a246b8546c',1,'atan2(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga479500e51eacd0650c2b7fd3134dfe6f',1,'atan2(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga911eecb5f18a765751dbbf2e3b749505',1,'atan2(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga551fdabe03747f18117c610707984c53',1,'atan2(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedb4907088a6e72095a82667ec0dae3d',1,'atan2(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e9557a4ab8f934e83942b629ffdba51',1,'atan2(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55aae8c51913a949a9a5926e63f44776',1,'atan2(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga634f63841368060113764d5d3fd4f5fd',1,'atan2(double s, const double4 &b)(Global Namespace)']]], + ['atan2_5f_698',['atan2_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49ad9adb23b8dcb67962c5360937851b',1,'cv::cudev::atan2_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49ad9adb23b8dcb67962c5360937851b',1,'atan2_()(Global Namespace)']]], + ['atan2_5ffunc_699',['atan2_func',['https://docs.opencv.org/4.2.0/d4/d8e/structcv_1_1cudev_1_1atan2__func.html',1,'cv::cudev']]], + ['atan2_5ffunc_3c_20double_20_3e_700',['atan2_func< double >',['https://docs.opencv.org/4.2.0/d8/d15/structcv_1_1cudev_1_1atan2__func_3_01double_01_4.html',1,'cv::cudev']]], + ['atan2_5ffunc_3c_20float_20_3e_701',['atan2_func< float >',['https://docs.opencv.org/4.2.0/d0/df1/structcv_1_1cudev_1_1atan2__func_3_01float_01_4.html',1,'cv::cudev']]], + ['atan2_5ffunc_3c_20schar_20_3e_702',['atan2_func< schar >',['https://docs.opencv.org/4.2.0/da/da9/structcv_1_1cudev_1_1atan2__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['atan2_5ffunc_3c_20short_20_3e_703',['atan2_func< short >',['https://docs.opencv.org/4.2.0/d9/dc9/structcv_1_1cudev_1_1atan2__func_3_01short_01_4.html',1,'cv::cudev']]], + ['atan2_5ffunc_3c_20uchar_20_3e_704',['atan2_func< uchar >',['https://docs.opencv.org/4.2.0/d3/d1d/structcv_1_1cudev_1_1atan2__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['atan2_5ffunc_3c_20uint_20_3e_705',['atan2_func< uint >',['https://docs.opencv.org/4.2.0/d1/d4a/structcv_1_1cudev_1_1atan2__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['atan2_5ffunc_3c_20ushort_20_3e_706',['atan2_func< ushort >',['https://docs.opencv.org/4.2.0/d3/d2f/structcv_1_1cudev_1_1atan2__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['atan_5f_707',['atan_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a9b23d645cd6a6fccaef17d81ce5ddf',1,'cv::cudev::atan_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a9b23d645cd6a6fccaef17d81ce5ddf',1,'atan_()(Global Namespace)']]], + ['atan_5ffunc_708',['atan_func',['https://docs.opencv.org/4.2.0/df/d91/structcv_1_1cudev_1_1atan__func.html',1,'cv::cudev']]], + ['atan_5ffunc_3c_20double_20_3e_709',['atan_func< double >',['https://docs.opencv.org/4.2.0/d4/d8e/structcv_1_1cudev_1_1atan__func_3_01double_01_4.html',1,'cv::cudev']]], + ['atan_5ffunc_3c_20float_20_3e_710',['atan_func< float >',['https://docs.opencv.org/4.2.0/d8/dc1/structcv_1_1cudev_1_1atan__func_3_01float_01_4.html',1,'cv::cudev']]], + ['atan_5ffunc_3c_20schar_20_3e_711',['atan_func< schar >',['https://docs.opencv.org/4.2.0/dd/d4a/structcv_1_1cudev_1_1atan__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['atan_5ffunc_3c_20short_20_3e_712',['atan_func< short >',['https://docs.opencv.org/4.2.0/d5/d20/structcv_1_1cudev_1_1atan__func_3_01short_01_4.html',1,'cv::cudev']]], + ['atan_5ffunc_3c_20uchar_20_3e_713',['atan_func< uchar >',['https://docs.opencv.org/4.2.0/dd/dce/structcv_1_1cudev_1_1atan__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['atan_5ffunc_3c_20uint_20_3e_714',['atan_func< uint >',['https://docs.opencv.org/4.2.0/d2/de6/structcv_1_1cudev_1_1atan__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['atan_5ffunc_3c_20ushort_20_3e_715',['atan_func< ushort >',['https://docs.opencv.org/4.2.0/d1/da0/structcv_1_1cudev_1_1atan__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['atanh_716',['atanh',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab87d29c00e6d75aeab43eff53bf5164c',1,'Eigen::MatrixBase::atanh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab87d29c00e6d75aeab43eff53bf5164c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::atanh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab87d29c00e6d75aeab43eff53bf5164c',1,'MatrixBase< Solve< Decomposition, RhsType > >::atanh()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7382bae640576ef972071950549b7844',1,'cv::cudev::atanh(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95356e3cd239ada11d924e9562cb3c64',1,'cv::cudev::atanh(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0117221d7840a2198927613398e20fb',1,'cv::cudev::atanh(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae64d84317c18b4cd7eb3962e030b0dd8',1,'cv::cudev::atanh(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab75aea5aa3f31272df86334ade578d78',1,'cv::cudev::atanh(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga546711360eb44f8b7120f2870f091d43',1,'cv::cudev::atanh(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4fa52f4bdf78dc1836ce04ec11173f2',1,'cv::cudev::atanh(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafccd9fe9b2011c871ced6f50fbeccdd',1,'cv::cudev::atanh(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc6c9052fbc49be729795ec31d9e0e1d',1,'cv::cudev::atanh(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadab3c3980412a93904c34de1c8ef5c34',1,'cv::cudev::atanh(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga159a0c3eb6143ae0dddcd2f5473a71b3',1,'cv::cudev::atanh(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7091bf46e1d23c5c861514300709851',1,'cv::cudev::atanh(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa18edb980d38f3601d79a348fa915e15',1,'cv::cudev::atanh(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e5147f5cf4e8e4e719adfeef1df755e',1,'cv::cudev::atanh(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5a277070a85d4a000613dfecb79c501',1,'cv::cudev::atanh(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4d50aa2b3224bd33dad1d3d04ad8a44',1,'cv::cudev::atanh(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cf30b9d65c02e122539508531c88d0d',1,'cv::cudev::atanh(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bdc3993d4fd0cf39012fb1e9bcfdc10',1,'cv::cudev::atanh(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeabb2086e7a0e46dbc340bf910527262',1,'cv::cudev::atanh(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga907bc6eb8c5861cfea9f27c966482d52',1,'cv::cudev::atanh(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7348a10e3b1d5efe4caf9dce3f6271a',1,'cv::cudev::atanh(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6ff46f8e3e5ff08cb10622a9e82f9dc',1,'cv::cudev::atanh(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf27c1925e07f578117d0b45471f796d',1,'cv::cudev::atanh(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5bc6dda3a104de7087fc7cade12695f4',1,'cv::cudev::atanh(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf243ab763fa932beffcc7b91ff25afd7',1,'cv::cudev::atanh(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef7a907aea347c40d17e76067e0d4c6a',1,'cv::cudev::atanh(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73bd058c5966fa3e812bdcd04c7eabcb',1,'cv::cudev::atanh(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43fd6b7419a33f29bc94ef35ceec0f51',1,'cv::cudev::atanh(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga826751d1ff7f93636dc46d85e2cc8f75',1,'cv::cudev::atanh(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac08b0b1627e3dbb613df67bda6cf1de1',1,'cv::cudev::atanh(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a8dc998f1edd38ba901f6ccc536dc14',1,'cv::cudev::atanh(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f54acfb1d41ea4260e841bb7dff3613',1,'cv::cudev::atanh(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7382bae640576ef972071950549b7844',1,'atanh(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95356e3cd239ada11d924e9562cb3c64',1,'atanh(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0117221d7840a2198927613398e20fb',1,'atanh(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae64d84317c18b4cd7eb3962e030b0dd8',1,'atanh(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab75aea5aa3f31272df86334ade578d78',1,'atanh(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga546711360eb44f8b7120f2870f091d43',1,'atanh(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4fa52f4bdf78dc1836ce04ec11173f2',1,'atanh(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafccd9fe9b2011c871ced6f50fbeccdd',1,'atanh(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc6c9052fbc49be729795ec31d9e0e1d',1,'atanh(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadab3c3980412a93904c34de1c8ef5c34',1,'atanh(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga159a0c3eb6143ae0dddcd2f5473a71b3',1,'atanh(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7091bf46e1d23c5c861514300709851',1,'atanh(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa18edb980d38f3601d79a348fa915e15',1,'atanh(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e5147f5cf4e8e4e719adfeef1df755e',1,'atanh(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5a277070a85d4a000613dfecb79c501',1,'atanh(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4d50aa2b3224bd33dad1d3d04ad8a44',1,'atanh(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cf30b9d65c02e122539508531c88d0d',1,'atanh(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bdc3993d4fd0cf39012fb1e9bcfdc10',1,'atanh(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeabb2086e7a0e46dbc340bf910527262',1,'atanh(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga907bc6eb8c5861cfea9f27c966482d52',1,'atanh(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7348a10e3b1d5efe4caf9dce3f6271a',1,'atanh(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6ff46f8e3e5ff08cb10622a9e82f9dc',1,'atanh(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf27c1925e07f578117d0b45471f796d',1,'atanh(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5bc6dda3a104de7087fc7cade12695f4',1,'atanh(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf243ab763fa932beffcc7b91ff25afd7',1,'atanh(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef7a907aea347c40d17e76067e0d4c6a',1,'atanh(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73bd058c5966fa3e812bdcd04c7eabcb',1,'atanh(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43fd6b7419a33f29bc94ef35ceec0f51',1,'atanh(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga826751d1ff7f93636dc46d85e2cc8f75',1,'atanh(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac08b0b1627e3dbb613df67bda6cf1de1',1,'atanh(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a8dc998f1edd38ba901f6ccc536dc14',1,'atanh(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f54acfb1d41ea4260e841bb7dff3613',1,'atanh(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abaa325495d208118ae2201fc82749a9e',1,'std::atanh()'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a45d37a9f1c784eb8ab61ed24f07f436f',1,'Eigen::atanh()']]], + ['atanh_5f_717',['atanh_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90fa68c268f5fc22387268dfa8628039',1,'cv::cudev::atanh_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90fa68c268f5fc22387268dfa8628039',1,'atanh_()(Global Namespace)']]], + ['atanh_5ffunc_718',['atanh_func',['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1cudev_1_1atanh__func.html',1,'cv::cudev']]], + ['atanh_5ffunc_3c_20double_20_3e_719',['atanh_func< double >',['https://docs.opencv.org/4.2.0/dd/d41/structcv_1_1cudev_1_1atanh__func_3_01double_01_4.html',1,'cv::cudev']]], + ['atanh_5ffunc_3c_20float_20_3e_720',['atanh_func< float >',['https://docs.opencv.org/4.2.0/dd/d2d/structcv_1_1cudev_1_1atanh__func_3_01float_01_4.html',1,'cv::cudev']]], + ['atanh_5ffunc_3c_20schar_20_3e_721',['atanh_func< schar >',['https://docs.opencv.org/4.2.0/d2/dd6/structcv_1_1cudev_1_1atanh__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['atanh_5ffunc_3c_20short_20_3e_722',['atanh_func< short >',['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1cudev_1_1atanh__func_3_01short_01_4.html',1,'cv::cudev']]], + ['atanh_5ffunc_3c_20uchar_20_3e_723',['atanh_func< uchar >',['https://docs.opencv.org/4.2.0/d7/d90/structcv_1_1cudev_1_1atanh__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['atanh_5ffunc_3c_20uint_20_3e_724',['atanh_func< uint >',['https://docs.opencv.org/4.2.0/d2/ddc/structcv_1_1cudev_1_1atanh__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['atanh_5ffunc_3c_20ushort_20_3e_725',['atanh_func< ushort >',['https://docs.opencv.org/4.2.0/d8/dd0/structcv_1_1cudev_1_1atanh__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['atdelete_726',['atdelete',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a7b1f9a5d6c7bfe011670757995c77f04',1,'cv::hdf::HDF5']]], + ['ate_727',['ate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'basic_ios< char, _Traits >::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'basic_iostream< char >::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'basic_istream< char >::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'basic_istream< char, _Traits >::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'basic_ostream< char >::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'basic_ostream< char, _Traits >::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_fstream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_ifstream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_ios::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_iostream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_istream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_istringstream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_ofstream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_ostream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_ostringstream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::basic_stringstream::ate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ad22225874e26210dfe11263279587e75',1,'std::ios_base::ate']]], + ['atexists_728',['atexists',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a3ce1d93d746a79d6eabaadeae783956e',1,'cv::hdf::HDF5']]], + ['atframesize_729',['atFrameSize',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a5d53b7574e0b2196962e8a2725ee5bf6',1,'cv::AVIWriteContainer']]], + ['atomic_730',['atomic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01727.html',1,'std::atomic< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00044.html',1,'(Global Namespace)']]], + ['atomic_2ehpp_731',['atomic.hpp',['https://docs.opencv.org/4.2.0/d5/d6c/atomic_8hpp.html',1,'']]], + ['atomic_3c_20_5ftp_20_2a_20_3e_732',['atomic< _Tp * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01735.html',1,'std']]], + ['atomic_3c_20bool_20_3e_733',['atomic< bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01731.html',1,'std']]], + ['atomic_3c_20char_20_3e_734',['atomic< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01739.html',1,'std']]], + ['atomic_3c_20char16_5ft_20_3e_735',['atomic< char16_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01787.html',1,'std']]], + ['atomic_3c_20char32_5ft_20_3e_736',['atomic< char32_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01791.html',1,'std']]], + ['atomic_3c_20int_20_3e_737',['atomic< int >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01759.html',1,'std']]], + ['atomic_3c_20long_20_3e_738',['atomic< long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01767.html',1,'std']]], + ['atomic_3c_20long_20long_20_3e_739',['atomic< long long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01775.html',1,'std']]], + ['atomic_3c_20short_20_3e_740',['atomic< short >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01751.html',1,'std']]], + ['atomic_3c_20signed_20char_20_3e_741',['atomic< signed char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01743.html',1,'std']]], + ['atomic_3c_20unsigned_20char_20_3e_742',['atomic< unsigned char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01747.html',1,'std']]], + ['atomic_3c_20unsigned_20int_20_3e_743',['atomic< unsigned int >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01763.html',1,'std']]], + ['atomic_3c_20unsigned_20long_20_3e_744',['atomic< unsigned long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01771.html',1,'std']]], + ['atomic_3c_20unsigned_20long_20long_20_3e_745',['atomic< unsigned long long >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01779.html',1,'std']]], + ['atomic_3c_20unsigned_20short_20_3e_746',['atomic< unsigned short >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01755.html',1,'std']]], + ['atomic_3c_20wchar_5ft_20_3e_747',['atomic< wchar_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01783.html',1,'std']]], + ['atomic_5fbase_2eh_748',['atomic_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00275.html',1,'']]], + ['atomic_5fbool_749',['atomic_bool',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf6086d29df25216dda5a4a25283e8c1b',1,'std::atomic_bool'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf6086d29df25216dda5a4a25283e8c1b',1,'atomic_bool(Global Namespace)']]], + ['atomic_5fchar_750',['atomic_char',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8cc2dcae0c8faa76777765c4f1c0556e',1,'std::atomic_char'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8cc2dcae0c8faa76777765c4f1c0556e',1,'atomic_char(Global Namespace)']]], + ['atomic_5fchar16_5ft_751',['atomic_char16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gabf645b9de4785104feaa9827cd672279',1,'std::atomic_char16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gabf645b9de4785104feaa9827cd672279',1,'atomic_char16_t(Global Namespace)']]], + ['atomic_5fchar32_5ft_752',['atomic_char32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaceeeb98077f495bd03a4a8186b93c042',1,'std::atomic_char32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaceeeb98077f495bd03a4a8186b93c042',1,'atomic_char32_t(Global Namespace)']]], + ['atomic_5fcompare_5fexchange_5fstrong_753',['atomic_compare_exchange_strong',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8b4c27092fe0543d16aa24679ab64f35',1,'std::atomic_compare_exchange_strong(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga7f9e658275d4a2cdbf1b6a00d02adcc7',1,'std::atomic_compare_exchange_strong(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8b4c27092fe0543d16aa24679ab64f35',1,'atomic_compare_exchange_strong(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga7f9e658275d4a2cdbf1b6a00d02adcc7',1,'atomic_compare_exchange_strong(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w)(Global Namespace)']]], + ['atomic_5fcompare_5fexchange_5fstrong_5fexplicit_754',['atomic_compare_exchange_strong_explicit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga7b812df2cdd0c01f09d65168d22418c9',1,'std::atomic_compare_exchange_strong_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w, memory_order, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8ac0b3f7aae34919ebc25fc54ff6b9c8',1,'std::atomic_compare_exchange_strong_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w, memory_order, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga7b812df2cdd0c01f09d65168d22418c9',1,'atomic_compare_exchange_strong_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w, memory_order, memory_order)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8ac0b3f7aae34919ebc25fc54ff6b9c8',1,'atomic_compare_exchange_strong_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w, memory_order, memory_order)(Global Namespace)']]], + ['atomic_5fcompare_5fexchange_5fweak_755',['atomic_compare_exchange_weak',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga6aa9828191cf7749c72581e719dde0b0',1,'std::atomic_compare_exchange_weak(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga6860aafd01c4daf71cca0efe5193437f',1,'std::atomic_compare_exchange_weak(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga6aa9828191cf7749c72581e719dde0b0',1,'atomic_compare_exchange_weak(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga6860aafd01c4daf71cca0efe5193437f',1,'atomic_compare_exchange_weak(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w)(Global Namespace)']]], + ['atomic_5fcompare_5fexchange_5fweak_5fexplicit_756',['atomic_compare_exchange_weak_explicit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8ddc9b0002afbe0001718de9c8ca931e',1,'std::atomic_compare_exchange_weak_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w, memory_order __success, memory_order __failure)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga31df9efdf79235d0f8e112d245deb431',1,'std::atomic_compare_exchange_weak_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w, memory_order __success, memory_order __failure)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8ddc9b0002afbe0001718de9c8ca931e',1,'atomic_compare_exchange_weak_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > *__v, shared_ptr< _Tp > __w, memory_order __success, memory_order __failure)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga31df9efdf79235d0f8e112d245deb431',1,'atomic_compare_exchange_weak_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > *__v, __shared_ptr< _Tp, _Lp > __w, memory_order __success, memory_order __failure)(Global Namespace)']]], + ['atomic_5fexchange_757',['atomic_exchange',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga0e05e0e96f4b0cfdce2e7f6143976070',1,'std::atomic_exchange(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga419348e5a13dcd7fdccd244f6c15bd35',1,'std::atomic_exchange(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga0e05e0e96f4b0cfdce2e7f6143976070',1,'atomic_exchange(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga419348e5a13dcd7fdccd244f6c15bd35',1,'atomic_exchange(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r)(Global Namespace)']]], + ['atomic_5fexchange_5fexplicit_758',['atomic_exchange_explicit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga663e97cb5020aa674934c4eda56ea7a0',1,'std::atomic_exchange_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac73bf6a6160e468fc776581bcecd5424',1,'std::atomic_exchange_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga663e97cb5020aa674934c4eda56ea7a0',1,'atomic_exchange_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r, memory_order)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac73bf6a6160e468fc776581bcecd5424',1,'atomic_exchange_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r, memory_order)(Global Namespace)']]], + ['atomic_5fflag_759',['atomic_flag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04819.html',1,'std']]], + ['atomic_5ffutex_2eh_760',['atomic_futex.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00278.html',1,'']]], + ['atomic_5fint_761',['atomic_int',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8e9e8e31eec44834b1fa3ec4e1ccf3e7',1,'std::atomic_int'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8e9e8e31eec44834b1fa3ec4e1ccf3e7',1,'atomic_int(Global Namespace)']]], + ['atomic_5fint16_5ft_762',['atomic_int16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga499c4d63597f582f334f53fe66390130',1,'std::atomic_int16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga499c4d63597f582f334f53fe66390130',1,'atomic_int16_t(Global Namespace)']]], + ['atomic_5fint32_5ft_763',['atomic_int32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaabd065724c5ce31539dedb8add48ac46',1,'std::atomic_int32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaabd065724c5ce31539dedb8add48ac46',1,'atomic_int32_t(Global Namespace)']]], + ['atomic_5fint64_5ft_764',['atomic_int64_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga919f362eb712ce8408b2e7fc93986ce9',1,'std::atomic_int64_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga919f362eb712ce8408b2e7fc93986ce9',1,'atomic_int64_t(Global Namespace)']]], + ['atomic_5fint8_5ft_765',['atomic_int8_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gab650a220c21b0cc1f05c207466d10f2b',1,'std::atomic_int8_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gab650a220c21b0cc1f05c207466d10f2b',1,'atomic_int8_t(Global Namespace)']]], + ['atomic_5fint_5ffast16_5ft_766',['atomic_int_fast16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaa216f3a1d57fa3c13c4d59ab3c45b461',1,'std::atomic_int_fast16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaa216f3a1d57fa3c13c4d59ab3c45b461',1,'atomic_int_fast16_t(Global Namespace)']]], + ['atomic_5fint_5ffast32_5ft_767',['atomic_int_fast32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8c46317e4ac11eaa3e53f2ec66158fc0',1,'std::atomic_int_fast32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8c46317e4ac11eaa3e53f2ec66158fc0',1,'atomic_int_fast32_t(Global Namespace)']]], + ['atomic_5fint_5ffast64_5ft_768',['atomic_int_fast64_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gac2dff45ca4a14c2bb7f1ad3360377344',1,'std::atomic_int_fast64_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gac2dff45ca4a14c2bb7f1ad3360377344',1,'atomic_int_fast64_t(Global Namespace)']]], + ['atomic_5fint_5ffast8_5ft_769',['atomic_int_fast8_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaecfbb17217b6ff2f0c15e49dfd7ec459',1,'std::atomic_int_fast8_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaecfbb17217b6ff2f0c15e49dfd7ec459',1,'atomic_int_fast8_t(Global Namespace)']]], + ['atomic_5fint_5fleast16_5ft_770',['atomic_int_least16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gad6a704d09ccc631022ebc6733817362b',1,'std::atomic_int_least16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gad6a704d09ccc631022ebc6733817362b',1,'atomic_int_least16_t(Global Namespace)']]], + ['atomic_5fint_5fleast32_5ft_771',['atomic_int_least32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga72bfafa96eaec8a7d8a0e71f706dd40f',1,'std::atomic_int_least32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga72bfafa96eaec8a7d8a0e71f706dd40f',1,'atomic_int_least32_t(Global Namespace)']]], + ['atomic_5fint_5fleast64_5ft_772',['atomic_int_least64_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf3dcb968315142320d83651f335325ff',1,'std::atomic_int_least64_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf3dcb968315142320d83651f335325ff',1,'atomic_int_least64_t(Global Namespace)']]], + ['atomic_5fint_5fleast8_5ft_773',['atomic_int_least8_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga1b1448266ad00a16c95e1f8bbc98e659',1,'std::atomic_int_least8_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga1b1448266ad00a16c95e1f8bbc98e659',1,'atomic_int_least8_t(Global Namespace)']]], + ['atomic_5fintmax_5ft_774',['atomic_intmax_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga02ac5738a7a9f78bf894ace288d90576',1,'std::atomic_intmax_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga02ac5738a7a9f78bf894ace288d90576',1,'atomic_intmax_t(Global Namespace)']]], + ['atomic_5fintptr_5ft_775',['atomic_intptr_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga479fe44f81f5f2a68e9b10d022e4b563',1,'std::atomic_intptr_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga479fe44f81f5f2a68e9b10d022e4b563',1,'atomic_intptr_t(Global Namespace)']]], + ['atomic_5fis_5flock_5ffree_776',['atomic_is_lock_free',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga26f0b2f2e5e143c43b9ac86853cdb495',1,'std::atomic_is_lock_free(const __shared_ptr< _Tp, _Lp > *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga5fe925503fa03a8132ab6ac8c3d05017',1,'std::atomic_is_lock_free(const shared_ptr< _Tp > *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga26f0b2f2e5e143c43b9ac86853cdb495',1,'atomic_is_lock_free(const __shared_ptr< _Tp, _Lp > *__p)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga5fe925503fa03a8132ab6ac8c3d05017',1,'atomic_is_lock_free(const shared_ptr< _Tp > *__p)(Global Namespace)']]], + ['atomic_5fllong_777',['atomic_llong',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gabf25364f5fd505a27d78d7e3434ec337',1,'std::atomic_llong'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gabf25364f5fd505a27d78d7e3434ec337',1,'atomic_llong(Global Namespace)']]], + ['atomic_5fload_778',['atomic_load',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gaa1f2f437e65f14cbc39dc5aa9c7787cb',1,'std::atomic_load(const shared_ptr< _Tp > *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga068286dfd18be5a7656c478f4b23ea11',1,'std::atomic_load(const __shared_ptr< _Tp, _Lp > *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gaa1f2f437e65f14cbc39dc5aa9c7787cb',1,'atomic_load(const shared_ptr< _Tp > *__p)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga068286dfd18be5a7656c478f4b23ea11',1,'atomic_load(const __shared_ptr< _Tp, _Lp > *__p)(Global Namespace)']]], + ['atomic_5fload_5fexplicit_779',['atomic_load_explicit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac5834272ab3ee80d5263ec71c30d4e40',1,'std::atomic_load_explicit(const shared_ptr< _Tp > *__p, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac10fed73419a9afc7442fcf685c9f4ef',1,'std::atomic_load_explicit(const __shared_ptr< _Tp, _Lp > *__p, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac5834272ab3ee80d5263ec71c30d4e40',1,'atomic_load_explicit(const shared_ptr< _Tp > *__p, memory_order)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac10fed73419a9afc7442fcf685c9f4ef',1,'atomic_load_explicit(const __shared_ptr< _Tp, _Lp > *__p, memory_order)(Global Namespace)']]], + ['atomic_5flockfree_5fdefines_2eh_780',['atomic_lockfree_defines.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00281.html',1,'']]], + ['atomic_5flong_781',['atomic_long',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga516afb5820a1d4d2bee3016c335e7f32',1,'std::atomic_long'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga516afb5820a1d4d2bee3016c335e7f32',1,'atomic_long(Global Namespace)']]], + ['atomic_5fptrdiff_5ft_782',['atomic_ptrdiff_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gac91469c8dac9ea566aa123ee72834456',1,'std::atomic_ptrdiff_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gac91469c8dac9ea566aa123ee72834456',1,'atomic_ptrdiff_t(Global Namespace)']]], + ['atomic_5fschar_783',['atomic_schar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga149ab9f968045c030b28cc66b21c90fe',1,'std::atomic_schar'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga149ab9f968045c030b28cc66b21c90fe',1,'atomic_schar(Global Namespace)']]], + ['atomic_5fshort_784',['atomic_short',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga57ba7af47bbbe212c68aac803df94e66',1,'std::atomic_short'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga57ba7af47bbbe212c68aac803df94e66',1,'atomic_short(Global Namespace)']]], + ['atomic_5fsize_5ft_785',['atomic_size_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga50f0c06e2ed82868b43d9fdf802c15dd',1,'std::atomic_size_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga50f0c06e2ed82868b43d9fdf802c15dd',1,'atomic_size_t(Global Namespace)']]], + ['atomic_5fstore_786',['atomic_store',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gaad7c9077082544dc2454ef66eb252cad',1,'std::atomic_store(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gaf607a58027ea400e7688daa2832c67ef',1,'std::atomic_store(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gaad7c9077082544dc2454ef66eb252cad',1,'atomic_store(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gaf607a58027ea400e7688daa2832c67ef',1,'atomic_store(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r)(Global Namespace)']]], + ['atomic_5fstore_5fexplicit_787',['atomic_store_explicit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac459811f24dfa61ca04dff98c59b0433',1,'std::atomic_store_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga4fb42f2c743388ba4dcf24abf0cc2701',1,'std::atomic_store_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r, memory_order)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#gac459811f24dfa61ca04dff98c59b0433',1,'atomic_store_explicit(shared_ptr< _Tp > *__p, shared_ptr< _Tp > __r, memory_order)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga4fb42f2c743388ba4dcf24abf0cc2701',1,'atomic_store_explicit(__shared_ptr< _Tp, _Lp > *__p, __shared_ptr< _Tp, _Lp > __r, memory_order)(Global Namespace)']]], + ['atomic_5fuchar_788',['atomic_uchar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gae195150d772d7de1590a467c94d2efbd',1,'std::atomic_uchar'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gae195150d772d7de1590a467c94d2efbd',1,'atomic_uchar(Global Namespace)']]], + ['atomic_5fuint_789',['atomic_uint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8229f523dabc2103dd045fbc7922deb6',1,'std::atomic_uint'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga8229f523dabc2103dd045fbc7922deb6',1,'atomic_uint(Global Namespace)']]], + ['atomic_5fuint16_5ft_790',['atomic_uint16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga60f6513810459148ec357bbb993ae031',1,'std::atomic_uint16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga60f6513810459148ec357bbb993ae031',1,'atomic_uint16_t(Global Namespace)']]], + ['atomic_5fuint32_5ft_791',['atomic_uint32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gafdf19d28e7b224eae4986982432e3031',1,'std::atomic_uint32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gafdf19d28e7b224eae4986982432e3031',1,'atomic_uint32_t(Global Namespace)']]], + ['atomic_5fuint64_5ft_792',['atomic_uint64_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga61a2758446aadb239e0f77a1b7e1c95d',1,'std::atomic_uint64_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga61a2758446aadb239e0f77a1b7e1c95d',1,'atomic_uint64_t(Global Namespace)']]], + ['atomic_5fuint8_5ft_793',['atomic_uint8_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga733c7b7c5f6035d86928e70083c3b74d',1,'std::atomic_uint8_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga733c7b7c5f6035d86928e70083c3b74d',1,'atomic_uint8_t(Global Namespace)']]], + ['atomic_5fuint_5ffast16_5ft_794',['atomic_uint_fast16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gab61c0b01e90d43f0213aa7abd2f5f335',1,'std::atomic_uint_fast16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gab61c0b01e90d43f0213aa7abd2f5f335',1,'atomic_uint_fast16_t(Global Namespace)']]], + ['atomic_5fuint_5ffast32_5ft_795',['atomic_uint_fast32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf84e67c027b9befda86fa336a250ad19',1,'std::atomic_uint_fast32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf84e67c027b9befda86fa336a250ad19',1,'atomic_uint_fast32_t(Global Namespace)']]], + ['atomic_5fuint_5ffast64_5ft_796',['atomic_uint_fast64_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga891df3fc547ce305e223078a002a30ae',1,'std::atomic_uint_fast64_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga891df3fc547ce305e223078a002a30ae',1,'atomic_uint_fast64_t(Global Namespace)']]], + ['atomic_5fuint_5ffast8_5ft_797',['atomic_uint_fast8_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga40baf341b0da82de1dda4f09d82e0ac5',1,'std::atomic_uint_fast8_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga40baf341b0da82de1dda4f09d82e0ac5',1,'atomic_uint_fast8_t(Global Namespace)']]], + ['atomic_5fuint_5fleast16_5ft_798',['atomic_uint_least16_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga5c55fde43e38cd4b03ca13fb1a5e2a22',1,'std::atomic_uint_least16_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga5c55fde43e38cd4b03ca13fb1a5e2a22',1,'atomic_uint_least16_t(Global Namespace)']]], + ['atomic_5fuint_5fleast32_5ft_799',['atomic_uint_least32_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga882202b2c37d84f063452cb6919f0a72',1,'std::atomic_uint_least32_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga882202b2c37d84f063452cb6919f0a72',1,'atomic_uint_least32_t(Global Namespace)']]], + ['atomic_5fuint_5fleast64_5ft_800',['atomic_uint_least64_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga90b9e9b26f9e2224e5623c59f27c36be',1,'std::atomic_uint_least64_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga90b9e9b26f9e2224e5623c59f27c36be',1,'atomic_uint_least64_t(Global Namespace)']]], + ['atomic_5fuint_5fleast8_5ft_801',['atomic_uint_least8_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga5328da93da870cab076210266f0b1ab4',1,'std::atomic_uint_least8_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga5328da93da870cab076210266f0b1ab4',1,'atomic_uint_least8_t(Global Namespace)']]], + ['atomic_5fuintmax_5ft_802',['atomic_uintmax_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga9567942c4ccb9bf8a98cc8bf9e0dd37b',1,'std::atomic_uintmax_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga9567942c4ccb9bf8a98cc8bf9e0dd37b',1,'atomic_uintmax_t(Global Namespace)']]], + ['atomic_5fuintptr_5ft_803',['atomic_uintptr_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga02e709315376fdc02556368b8035c5ac',1,'std::atomic_uintptr_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga02e709315376fdc02556368b8035c5ac',1,'atomic_uintptr_t(Global Namespace)']]], + ['atomic_5fullong_804',['atomic_ullong',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga3c5b7b2c577e1b477dc11dc501dfff44',1,'std::atomic_ullong'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga3c5b7b2c577e1b477dc11dc501dfff44',1,'atomic_ullong(Global Namespace)']]], + ['atomic_5fulong_805',['atomic_ulong',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga00ea9684fdf38053c69ad0235e67eb26',1,'std::atomic_ulong'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga00ea9684fdf38053c69ad0235e67eb26',1,'atomic_ulong(Global Namespace)']]], + ['atomic_5fushort_806',['atomic_ushort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf0c7dae0fbcf1dbaf85913a5cece6462',1,'std::atomic_ushort'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#gaf0c7dae0fbcf1dbaf85913a5cece6462',1,'atomic_ushort(Global Namespace)']]], + ['atomic_5fwchar_5ft_807',['atomic_wchar_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga817fa93d87437b86fd8cbd6e77458631',1,'std::atomic_wchar_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html#ga817fa93d87437b86fd8cbd6e77458631',1,'atomic_wchar_t(Global Namespace)']]], + ['atomic_5fword_2eh_808',['atomic_word.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00653.html',1,'']]], + ['atomicadd_809',['atomicAdd',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24983bb54630f3972b78a2daf7b0349a',1,'cv::cudev::atomicAdd(int *address, int val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755510388511482ae25f7496c18f2693',1,'cv::cudev::atomicAdd(uint *address, uint val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a537f36200198b96f14d70c573920ff',1,'cv::cudev::atomicAdd(float *address, float val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7541b491f2bb24961a4b77e55a32fee6',1,'cv::cudev::atomicAdd(double *address, double val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24983bb54630f3972b78a2daf7b0349a',1,'atomicAdd(int *address, int val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755510388511482ae25f7496c18f2693',1,'atomicAdd(uint *address, uint val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a537f36200198b96f14d70c573920ff',1,'atomicAdd(float *address, float val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7541b491f2bb24961a4b77e55a32fee6',1,'atomicAdd(double *address, double val)(Global Namespace)']]], + ['atomicity_2eh_810',['atomicity.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01031.html',1,'']]], + ['atomicmax_811',['atomicMax',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc9ae21a3fcf8ee75b504da0abe6da1c',1,'cv::cudev::atomicMax(int *address, int val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98ed0c7d007afb902cab16a16661a429',1,'cv::cudev::atomicMax(uint *address, uint val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa027ed0024229eced7f50b2a0896ac7e',1,'cv::cudev::atomicMax(float *address, float val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae670100963e0bf857f744d58d0666d9e',1,'cv::cudev::atomicMax(double *address, double val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc9ae21a3fcf8ee75b504da0abe6da1c',1,'atomicMax(int *address, int val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98ed0c7d007afb902cab16a16661a429',1,'atomicMax(uint *address, uint val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa027ed0024229eced7f50b2a0896ac7e',1,'atomicMax(float *address, float val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae670100963e0bf857f744d58d0666d9e',1,'atomicMax(double *address, double val)(Global Namespace)']]], + ['atomicmin_812',['atomicMin',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a9495384dfe645d9d431a26c2102572',1,'cv::cudev::atomicMin(int *address, int val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd7815fa5c09f7724139aafa44eebe9',1,'cv::cudev::atomicMin(uint *address, uint val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga016d917b9d0d81f3190f1be42953ab05',1,'cv::cudev::atomicMin(float *address, float val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b67ac13502219776cf65f38cb62975f',1,'cv::cudev::atomicMin(double *address, double val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a9495384dfe645d9d431a26c2102572',1,'atomicMin(int *address, int val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd7815fa5c09f7724139aafa44eebe9',1,'atomicMin(uint *address, uint val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga016d917b9d0d81f3190f1be42953ab05',1,'atomicMin(float *address, float val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b67ac13502219776cf65f38cb62975f',1,'atomicMin(double *address, double val)(Global Namespace)']]], + ['atomics_813',['Atomics',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html',1,'']]], + ['atread_814',['atread',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a57d7777e74ec5dd83ee3c8533927dec8',1,'cv::hdf::HDF5::atread(int *value, const String &atlabel)=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#aaeddc16f4cb1d4f1b299f477ac5b1264',1,'cv::hdf::HDF5::atread(double *value, const String &atlabel)=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a9d18050b603b806de09e9e7339c066f4',1,'cv::hdf::HDF5::atread(String *value, const String &atlabel)=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a74a8bcd8bf608a6cb2c5bde81215556a',1,'cv::hdf::HDF5::atread(OutputArray value, const String &atlabel)=0']]], + ['attachcontext_815',['attachContext',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gaf83af36be2097fd43e3eba5c8f3025b1',1,'cv::ocl::attachContext()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gaf83af36be2097fd43e3eba5c8f3025b1',1,'attachContext()(Global Namespace)']]], + ['attempts_816',['attempts',['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#a38cc72f20413df1fd2de0f2e10ef9af2',1,'cv::BOWKMeansTrainer']]], + ['attributes_817',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]], + ['atwrite_818',['atwrite',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#adee759dc8dd95d6423d9a236527dacb8',1,'cv::hdf::HDF5::atwrite(const int value, const String &atlabel)=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a8ca86bdaa18f2fa2133a5e8e76026a33',1,'cv::hdf::HDF5::atwrite(const double value, const String &atlabel)=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a656476fc6396e46c7ec309eb6aae30c3',1,'cv::hdf::HDF5::atwrite(const String &value, const String &atlabel)=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#ac62bd87e92b349d1992e770052314572',1,'cv::hdf::HDF5::atwrite(InputArray value, const String &atlabel)=0']]], + ['augassignadd_819',['augAssignAdd',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#aef1fe46a1ea6c41cf63d809b0ce548d0',1,'cv::MatOp']]], + ['augassignand_820',['augAssignAnd',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a37fae0add0d6e798ce92e557db2eeee2',1,'cv::MatOp']]], + ['augassigndivide_821',['augAssignDivide',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#aec933b6b67e03715da4dfce17d57ce15',1,'cv::MatOp']]], + ['augassignmultiply_822',['augAssignMultiply',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a2e52d774d4302c606fbc17d644eacce3',1,'cv::MatOp']]], + ['augassignor_823',['augAssignOr',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#aa32c6465441d60c7f4822fb206a426eb',1,'cv::MatOp']]], + ['augassignsubtract_824',['augAssignSubtract',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a3fd99639183ba7ee3b0b341c79cfac6b',1,'cv::MatOp']]], + ['augassignxor_825',['augAssignXor',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a56f3b1d244a55aa5b48c56478e587899',1,'cv::MatOp']]], + ['augmentedunscentedkalmanfilterparams_826',['AugmentedUnscentedKalmanFilterParams',['https://docs.opencv.org/4.2.0/d9/d0b/classcv_1_1tracking_1_1AugmentedUnscentedKalmanFilterParams.html',1,'cv::tracking::AugmentedUnscentedKalmanFilterParams'],['https://docs.opencv.org/4.2.0/d9/d0b/classcv_1_1tracking_1_1AugmentedUnscentedKalmanFilterParams.html#ab84b6588189cd1aff46b5a099aaee96e',1,'cv::tracking::AugmentedUnscentedKalmanFilterParams::AugmentedUnscentedKalmanFilterParams()'],['https://docs.opencv.org/4.2.0/d9/d0b/classcv_1_1tracking_1_1AugmentedUnscentedKalmanFilterParams.html#a26497f15b36f68ec4e105b01b2e6340c',1,'cv::tracking::AugmentedUnscentedKalmanFilterParams::AugmentedUnscentedKalmanFilterParams(int dp, int mp, int cp, double processNoiseCovDiag, double measurementNoiseCovDiag, Ptr< UkfSystemModel > dynamicalSystem, int type=CV_64F)']]], + ['auto_5fptr_827',['auto_ptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html',1,'std::auto_ptr< _Tp >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a4029546a38036de379586d8514a02ebb',1,'std::auto_ptr::auto_ptr(element_type *__p=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#aa88c998565d04c8e882a3b579e46c055',1,'std::auto_ptr::auto_ptr(auto_ptr &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a10d7a4a15c88b4953d090c08dfc87e14',1,'std::auto_ptr::auto_ptr(auto_ptr< _Tp1 > &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a829d06b1a12a622608a3cce322238fc6',1,'std::auto_ptr::auto_ptr(auto_ptr_ref< element_type > __ref)']]], + ['auto_5fptr_2eh_828',['auto_ptr.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00728.html',1,'']]], + ['auto_5fptr_5fref_829',['auto_ptr_ref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08507.html',1,'std']]], + ['auto_5fstep_830',['AUTO_STEP',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ac0da3ccbc32a8894fc03afb9cea40150a1c147538fd896f4f9abce9eaea9727e3',1,'cv::Mat::AUTO_STEP'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a6ab40566550b27870824c5e6559767c3a6a15e8efae303515b6ac5a752d688ad3',1,'cv::gapi::own::detail::MatHeader::AUTO_STEP'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#abf9262de727fd7542c5bead234fc41cea10741a8eaf539b2cb513c134641c940f',1,'cv::UMat::AUTO_STEP']]], + ['autoalign_831',['AutoAlign',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13ad0e7f67d40bcde3d41c12849b16ce6ea',1,'Eigen::AutoAlign'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13ad0e7f67d40bcde3d41c12849b16ce6ea',1,'AutoAlign(Global Namespace)']]], + ['autobuffer_832',['AutoBuffer',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'cv::AutoBuffer< _Tp, fixed_size >'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a990ab2dd088c226def0e59177933c9df',1,'cv::AutoBuffer::AutoBuffer()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ac498c6689e5a18843e1c9d23441c3a99',1,'cv::AutoBuffer::AutoBuffer(size_t _size)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3416e6aa3bb03435706abce813950d6e',1,'cv::AutoBuffer::AutoBuffer(const AutoBuffer< _Tp, fixed_size > &buf)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a990ab2dd088c226def0e59177933c9df',1,'AutoBuffer< double, 1 >::AutoBuffer()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ac498c6689e5a18843e1c9d23441c3a99',1,'AutoBuffer< double, 1 >::AutoBuffer(size_t _size)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3416e6aa3bb03435706abce813950d6e',1,'AutoBuffer< double, 1 >::AutoBuffer(const AutoBuffer< double, fixed_size > &buf)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a990ab2dd088c226def0e59177933c9df',1,'AutoBuffer< int64, 1 >::AutoBuffer()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ac498c6689e5a18843e1c9d23441c3a99',1,'AutoBuffer< int64, 1 >::AutoBuffer(size_t _size)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3416e6aa3bb03435706abce813950d6e',1,'AutoBuffer< int64, 1 >::AutoBuffer(const AutoBuffer< int64, fixed_size > &buf)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a990ab2dd088c226def0e59177933c9df',1,'AutoBuffer< String, 1 >::AutoBuffer()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ac498c6689e5a18843e1c9d23441c3a99',1,'AutoBuffer< String, 1 >::AutoBuffer(size_t _size)'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3416e6aa3bb03435706abce813950d6e',1,'AutoBuffer< String, 1 >::AutoBuffer(const AutoBuffer< String, fixed_size > &buf)']]], + ['autobuffer_3c_20double_2c_201_20_3e_833',['AutoBuffer< double, 1 >',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'AutoBuffer< double, 1 >'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'cv::AutoBuffer< double, 1 >']]], + ['autobuffer_3c_20int64_2c_201_20_3e_834',['AutoBuffer< int64, 1 >',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'AutoBuffer< int64, 1 >'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'cv::AutoBuffer< int64, 1 >']]], + ['autobuffer_3c_20string_2c_201_20_3e_835',['AutoBuffer< String, 1 >',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'AutoBuffer< String, 1 >'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'cv::AutoBuffer< String, 1 >']]], + ['autocalib_2ehpp_836',['autocalib.hpp',['https://docs.opencv.org/4.2.0/d3/d45/autocalib_8hpp.html',1,'']]], + ['autocalibration_837',['Autocalibration',['https://docs.opencv.org/4.2.0/d4/dbc/group__stitching__autocalib.html',1,'']]], + ['autolock_838',['AutoLock',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaac6054394f54fbbc849a09f4286774e9',1,'cv::AutoLock'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaac6054394f54fbbc849a09f4286774e9',1,'AutoLock(Global Namespace)']]], + ['automatic_20formatting_20with_20tt_20clang_20format_20tt_839',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], + ['autonomoustask_840',['AutonomousTask',['../classautonomous_1_1AutonomousTask.html',1,'autonomous']]], + ['autotuned_5findex_2eh_841',['autotuned_index.h',['https://docs.opencv.org/4.2.0/d1/dc3/autotuned__index_8h.html',1,'']]], + ['available_842',['available',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a702ddb75d538501184c313b56b576e7f',1,'cv::ocl::Device']]], + ['avcapturevideodataoutputsamplebufferdelegate_2dp_2dp_843',['AVCaptureVideoDataOutputSampleBufferDelegate-p-p',['https://docs.opencv.org/4.2.0/d7/dc6/classAVCaptureVideoDataOutputSampleBufferDelegate-p.html',1,'']]], + ['avepoolpaddedarea_844',['avePoolPaddedArea',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a6138276571a0cf1f4c9ac1335c7f75b8',1,'cv::dnn::PoolingLayer']]], + ['average_5fhash_2ehpp_845',['average_hash.hpp',['https://docs.opencv.org/4.2.0/d7/d22/average__hash_8hpp.html',1,'']]], + ['averagehash_846',['AverageHash',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1img__hash_1_1AverageHash.html',1,'cv::img_hash::AverageHash'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1img__hash_1_1AverageHash.html#af8ebaf26ead55018ebb9bca5ba0ef761',1,'cv::img_hash::AverageHash::AverageHash()']]], + ['averagehash_847',['averageHash',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga482a3fdcb92bfff57cdc2aed2b5bc47e',1,'cv::img_hash::averageHash()'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga482a3fdcb92bfff57cdc2aed2b5bc47e',1,'averageHash()(Global Namespace)']]], + ['avg_848',['Avg',['https://docs.opencv.org/4.2.0/da/dad/structcv_1_1cudev_1_1Avg.html',1,'cv::cudev']]], + ['avgbitrate_849',['AvgBitrate',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a0c6d0900fbb3241b1d80c8c46b2b9825',1,'cv::cudacodec::EncoderParams']]], + ['avireadcontainer_850',['AVIReadContainer',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html',1,'cv::AVIReadContainer'],['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#aeeb6d710add21767b1e9baa67e171c09',1,'cv::AVIReadContainer::AVIReadContainer()']]], + ['aviwritecontainer_851',['AVIWriteContainer',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html',1,'cv::AVIWriteContainer'],['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a3a71f42925fe83e518c3fcc425cc6297',1,'cv::AVIWriteContainer::AVIWriteContainer()']]], + ['awk_852',['awk',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a1de0f54830ba2d86ca5244f8609fef2c',1,'std::regex_constants']]], + ['ax_5flbx_853',['Ax_lBx',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a5eb11a88a4bd445f58f1b24598d3848f',1,'Eigen::Ax_lBx'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a5eb11a88a4bd445f58f1b24598d3848f',1,'Ax_lBx(Global Namespace)']]], + ['axes_854',['axes',['https://docs.opencv.org/4.2.0/d2/d71/classcv_1_1xfeatures2d_1_1Elliptic__KeyPoint.html#acc9ec69d02052ee9fc5634c2c2ea4534',1,'cv::xfeatures2d::Elliptic_KeyPoint']]], + ['axis_855',['axis',['https://docs.opencv.org/4.2.0/da/d5c/classcv_1_1dnn_1_1ConcatLayer.html#a1f11c2cdc4398cd0bd5875233ee1a256',1,'cv::dnn::ConcatLayer::axis'],['https://docs.opencv.org/4.2.0/d0/dc7/classcv_1_1dnn_1_1InnerProductLayer.html#a802e2eecf90aec44f37c8e26501b7805',1,'cv::dnn::InnerProductLayer::axis'],['https://docs.opencv.org/4.2.0/dd/dde/classcv_1_1dnn_1_1ScaleLayer.html#adff905f1897b2726e9e7b93095058c76',1,'cv::dnn::ScaleLayer::axis'],['https://docs.opencv.org/4.2.0/de/d61/classcv_1_1dnn_1_1SliceLayer.html#a2feb2f10f8ea482f35851dcd1890f9ee',1,'cv::dnn::SliceLayer::axis'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a6fe6a68ebe395dd43953592813cdeee5',1,'Eigen::AngleAxis::axis()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#aeb281dd2ac2332c876da30ee708f15fe',1,'Eigen::AngleAxis::axis() const']]], + ['azure_856',['azure',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a694182da3ec2c3895d44455e81d3841b',1,'cv::viz::Color']]] ]; diff --git a/search/all_b.js b/search/all_b.js index b9ff62c2..906a4a3e 100644 --- a/search/all_b.js +++ b/search/all_b.js @@ -7,45 +7,45 @@ var searchData= ['back_5finsert_5fiterator_4',['back_insert_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html',1,'std::back_insert_iterator< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#a0fc044f06510c501f45d1b6c69e0ad80',1,'std::back_insert_iterator::back_insert_iterator()']]], ['back_5finserter_5',['back_inserter',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga59459a8d387b04212f0f270cf24269ff',1,'std::back_inserter()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga59459a8d387b04212f0f270cf24269ff',1,'back_inserter(_Container &__x)(Global Namespace)']]], ['back_5fprojection_2emarkdown_6',['back_projection.markdown',['https://docs.opencv.org/4.2.0/d5/dbb/back__projection_8markdown.html',1,'']]], - ['backend_7',['backend',['https://docs.opencv.org/4.2.0/da/dcd/structcv_1_1gapi_1_1GNetParam.html#a836be1a9887d0e5d1f59ae6cc52614f4',1,'cv::gapi::GNetParam::backend'],['https://docs.opencv.org/4.2.0/d0/d71/classcv_1_1detail_1_1GCompoundKernelImpl.html#ac6e29ba60e8dfe181eab4152cf6f9d4c',1,'cv::detail::GCompoundKernelImpl::backend()'],['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1GCPUKernelImpl.html#a1e51d53bc3bcdc1425042c9b9429b4e3',1,'cv::GCPUKernelImpl::backend()'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1GFluidKernelImpl.html#a62a9bc5a8416759d171d45b86e19328f',1,'cv::GFluidKernelImpl::backend()'],['https://docs.opencv.org/4.2.0/d0/d0d/classcv_1_1GOCLKernelImpl.html#a1a6acaf585f91c212e24d860cf28eaf4',1,'cv::GOCLKernelImpl::backend()'],['https://docs.opencv.org/4.2.0/d1/d8a/classcv_1_1GPlaidMLKernelImpl.html#aca47bb03f58024930dd3ec9cec95d64e',1,'cv::GPlaidMLKernelImpl::backend()'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#ad52482244db5c0c348ecc09b73516064',1,'cv::gapi::ie::Params::backend()'],['https://docs.opencv.org/4.2.0/d8/d5c/namespacecv_1_1gapi_1_1compound.html#a1e231c4c2d4c0166c354e5f1adebe9d7',1,'cv::gapi::compound::backend()'],['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html#ga0ea1033f48e85753bcd35218f7384ea7',1,'cv::gapi::cpu::backend()'],['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html#ga022e60a8bd0047ea84ad1ec4ddd1ddd4',1,'cv::gapi::fluid::backend()'],['https://docs.opencv.org/4.2.0/d1/dae/namespacecv_1_1gapi_1_1ie.html#a5f9e491fbf88b8b8ae40904e86cd82b2',1,'cv::gapi::ie::backend()'],['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html#gae15a5e1a5d90af30f79f1fad75afda96',1,'cv::gapi::ocl::backend()'],['https://docs.opencv.org/4.2.0/d6/dbb/namespacecv_1_1gapi_1_1plaidml.html#adbea99141d627260981a6f138a1e73c5',1,'cv::gapi::plaidml::backend()'],['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html#ga022e60a8bd0047ea84ad1ec4ddd1ddd4',1,'backend()(Global Namespace)']]], - ['backend_8',['Backend',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga186f7d9bfacac8b0ff2e26e2eab02625',1,'cv::dnn::Backend'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga186f7d9bfacac8b0ff2e26e2eab02625',1,'Backend(Global Namespace)']]], - ['backend_9',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], - ['backend_20for_20improve_20efficiency_10',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], - ['backendid_11',['backendId',['https://docs.opencv.org/4.2.0/d2/dbb/classcv_1_1dnn_1_1BackendNode.html#ac55a2b7772eb34186133b5410950e944',1,'cv::dnn::BackendNode::backendId'],['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#a93c4757ba0f720e8133d2f14ee8425f5',1,'cv::dnn::BackendWrapper::backendId']]], - ['backendnode_12',['BackendNode',['https://docs.opencv.org/4.2.0/d2/dbb/classcv_1_1dnn_1_1BackendNode.html',1,'cv::dnn::BackendNode'],['https://docs.opencv.org/4.2.0/d2/dbb/classcv_1_1dnn_1_1BackendNode.html#a45e71e013bb2ed695e18644a73375c33',1,'cv::dnn::BackendNode::BackendNode()']]], + ['backend_7',['Backend',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga186f7d9bfacac8b0ff2e26e2eab02625',1,'cv::dnn::Backend'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#ga186f7d9bfacac8b0ff2e26e2eab02625',1,'Backend(Global Namespace)']]], + ['backend_8',['backend',['https://docs.opencv.org/4.2.0/da/dcd/structcv_1_1gapi_1_1GNetParam.html#a836be1a9887d0e5d1f59ae6cc52614f4',1,'cv::gapi::GNetParam::backend'],['https://docs.opencv.org/4.2.0/d0/d71/classcv_1_1detail_1_1GCompoundKernelImpl.html#ac6e29ba60e8dfe181eab4152cf6f9d4c',1,'cv::detail::GCompoundKernelImpl::backend()'],['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1GCPUKernelImpl.html#a1e51d53bc3bcdc1425042c9b9429b4e3',1,'cv::GCPUKernelImpl::backend()'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1GFluidKernelImpl.html#a62a9bc5a8416759d171d45b86e19328f',1,'cv::GFluidKernelImpl::backend()'],['https://docs.opencv.org/4.2.0/d0/d0d/classcv_1_1GOCLKernelImpl.html#a1a6acaf585f91c212e24d860cf28eaf4',1,'cv::GOCLKernelImpl::backend()'],['https://docs.opencv.org/4.2.0/d1/d8a/classcv_1_1GPlaidMLKernelImpl.html#aca47bb03f58024930dd3ec9cec95d64e',1,'cv::GPlaidMLKernelImpl::backend()'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#ad52482244db5c0c348ecc09b73516064',1,'cv::gapi::ie::Params::backend()'],['https://docs.opencv.org/4.2.0/d8/d5c/namespacecv_1_1gapi_1_1compound.html#a1e231c4c2d4c0166c354e5f1adebe9d7',1,'cv::gapi::compound::backend()'],['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html#ga0ea1033f48e85753bcd35218f7384ea7',1,'cv::gapi::cpu::backend()'],['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html#ga022e60a8bd0047ea84ad1ec4ddd1ddd4',1,'cv::gapi::fluid::backend()'],['https://docs.opencv.org/4.2.0/d1/dae/namespacecv_1_1gapi_1_1ie.html#a5f9e491fbf88b8b8ae40904e86cd82b2',1,'cv::gapi::ie::backend()'],['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html#gae15a5e1a5d90af30f79f1fad75afda96',1,'cv::gapi::ocl::backend()'],['https://docs.opencv.org/4.2.0/d6/dbb/namespacecv_1_1gapi_1_1plaidml.html#adbea99141d627260981a6f138a1e73c5',1,'cv::gapi::plaidml::backend()'],['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html#ga022e60a8bd0047ea84ad1ec4ddd1ddd4',1,'backend()(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'How to schedule your network for Halide backend']]], + ['backend_20for_20improve_20efficiency_9',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], + ['backendid_10',['backendId',['https://docs.opencv.org/4.2.0/d2/dbb/classcv_1_1dnn_1_1BackendNode.html#ac55a2b7772eb34186133b5410950e944',1,'cv::dnn::BackendNode::backendId'],['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#a93c4757ba0f720e8133d2f14ee8425f5',1,'cv::dnn::BackendWrapper::backendId']]], + ['backendnode_11',['BackendNode',['https://docs.opencv.org/4.2.0/d2/dbb/classcv_1_1dnn_1_1BackendNode.html',1,'cv::dnn::BackendNode'],['https://docs.opencv.org/4.2.0/d2/dbb/classcv_1_1dnn_1_1BackendNode.html#a45e71e013bb2ed695e18644a73375c33',1,'cv::dnn::BackendNode::BackendNode()']]], + ['backends_12',['G-API Standard Backends',['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html',1,'']]], ['backends_13',['backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'Additional flags for video I/O API backends'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#a588a9ca84d58acf02089798cccfc474c',1,'cv::gapi::GKernelPackage::backends()'],['https://docs.opencv.org/4.2.0/de/dc4/structcv_1_1gapi_1_1GNetPackage.html#ae58f3356e67967b09b5614cb452952ad',1,'cv::gapi::GNetPackage::backends()']]], - ['backends_14',['G-API Standard Backends',['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html',1,'']]], - ['backends_20registry_15',['Query I/O API backends registry',['https://docs.opencv.org/4.2.0/de/db1/group__videoio__registry.html',1,'']]], - ['backendwrapper_16',['BackendWrapper',['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html',1,'cv::dnn::BackendWrapper'],['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#a523b1266b28c68bf80153fe1cce064fc',1,'cv::dnn::BackendWrapper::BackendWrapper(int backendId, int targetId)'],['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#a4f78e2ddc8f0aeadfc1ae173cc279e3e',1,'cv::dnn::BackendWrapper::BackendWrapper(int targetId, const cv::Mat &m)'],['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#aba12624858d3e17d6702d0e4061d9e65',1,'cv::dnn::BackendWrapper::BackendWrapper(const Ptr< BackendWrapper > &base, const MatShape &shape)']]], - ['background_17',['background',['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#a8050ffa819ecda412bb219d8044ced22',1,'cv::datasets::GR_skigObj']]], - ['background_20foreground_20segmentation_20methods_18',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], - ['background_20segmentation_19',['Background Segmentation',['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html',1,'']]], - ['background_20subtraction_20',['Background Subtraction',['https://docs.opencv.org/4.2.0/db/d5c/tutorial_py_bg_subtraction.html',1,'Background Subtraction'],['https://docs.opencv.org/4.2.0/de/df4/tutorial_js_bg_subtraction.html',1,'Background Subtraction'],['https://docs.opencv.org/4.2.0/d8/d38/tutorial_bgsegm_bg_subtraction.html',1,'Background Subtraction']]], - ['background_20subtraction_20methods_21',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], - ['background_5fratio_22',['background_ratio',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#add9a220079347042688a79d2d0fba5b1',1,'cv::TrackerCSRT::Params']]], - ['background_5fsegm_2ehpp_23',['background_segm.hpp',['https://docs.opencv.org/4.2.0/db/d73/background__segm_8hpp.html',1,'']]], - ['background_5fsubtraction_2emarkdown_24',['background_subtraction.markdown',['https://docs.opencv.org/4.2.0/d1/d6d/background__subtraction_8markdown.html',1,'']]], - ['backgroundsubtractor_25',['BackgroundSubtractor',['https://docs.opencv.org/4.2.0/d7/df6/classcv_1_1BackgroundSubtractor.html',1,'cv']]], - ['backgroundsubtractorcnt_26',['BackgroundSubtractorCNT',['https://docs.opencv.org/4.2.0/de/dca/classcv_1_1bgsegm_1_1BackgroundSubtractorCNT.html',1,'cv::bgsegm']]], - ['backgroundsubtractorfgd_27',['BackgroundSubtractorFGD',['https://docs.opencv.org/4.2.0/d3/dd2/classcv_1_1cuda_1_1BackgroundSubtractorFGD.html',1,'cv::cuda']]], - ['backgroundsubtractorgmg_28',['BackgroundSubtractorGMG',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html',1,'cv::bgsegm::BackgroundSubtractorGMG'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html',1,'cv::cuda::BackgroundSubtractorGMG']]], - ['backgroundsubtractorgsoc_29',['BackgroundSubtractorGSOC',['https://docs.opencv.org/4.2.0/d4/dd5/classcv_1_1bgsegm_1_1BackgroundSubtractorGSOC.html',1,'cv::bgsegm']]], - ['backgroundsubtractorknn_30',['BackgroundSubtractorKNN',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html',1,'cv']]], - ['backgroundsubtractorlsbp_31',['BackgroundSubtractorLSBP',['https://docs.opencv.org/4.2.0/de/d4c/classcv_1_1bgsegm_1_1BackgroundSubtractorLSBP.html',1,'cv::bgsegm']]], - ['backgroundsubtractorlsbpdesc_32',['BackgroundSubtractorLSBPDesc',['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1bgsegm_1_1BackgroundSubtractorLSBPDesc.html',1,'cv::bgsegm']]], - ['backgroundsubtractormog_33',['BackgroundSubtractorMOG',['https://docs.opencv.org/4.2.0/d6/da7/classcv_1_1bgsegm_1_1BackgroundSubtractorMOG.html',1,'cv::bgsegm::BackgroundSubtractorMOG'],['https://docs.opencv.org/4.2.0/d1/dfe/classcv_1_1cuda_1_1BackgroundSubtractorMOG.html',1,'cv::cuda::BackgroundSubtractorMOG']]], - ['backgroundsubtractormog2_34',['BackgroundSubtractorMOG2',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html',1,'cv::BackgroundSubtractorMOG2'],['https://docs.opencv.org/4.2.0/df/d23/classcv_1_1cuda_1_1BackgroundSubtractorMOG2.html',1,'cv::cuda::BackgroundSubtractorMOG2']]], - ['backgroundtype_35',['backgroundType',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gaf7e286a941a896732aa34847bab9b182',1,'cv::datasets::backgroundType'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gaf7e286a941a896732aa34847bab9b182',1,'backgroundType(Global Namespace)']]], - ['backproject_36',['backProject',['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a5f84cfbdb25b9833cc1bfb5bd484ea79',1,'cv::PCA::backProject(InputArray vec) const'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a3b2dae725800de973be1135e92b1686a',1,'cv::PCA::backProject(InputArray vec, OutputArray result) const']]], - ['backprojection_37',['Backprojection',['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_histogram_backprojection.html',1,'Histogram - 3 : Histogram Backprojection'],['https://docs.opencv.org/4.2.0/dc/df6/tutorial_py_histogram_backprojection.html',1,'Histogram - 4 : Histogram Backprojection']]], - ['backprop_38',['BACKPROP',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a012b34ee340b5d4d11b6844e12816181aaca348d78617e21b3fad5cc4c27e7889',1,'cv::ml::ANN_MLP']]], - ['backsubst_39',['backSubst',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a9d50bc1c641fdeff7543197d5a4f3b3d',1,'cv::SVD::backSubst(InputArray rhs, OutputArray dst) const'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a7c28935c9999977dbe34285d13d43190',1,'cv::SVD::backSubst(InputArray w, InputArray u, InputArray vt, InputArray rhs, OutputArray dst)'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#ae398d073d71188ed3e18ef27801b43b8',1,'cv::SVD::backSubst(const Matx< _Tp, nm, 1 > &w, const Matx< _Tp, m, nm > &u, const Matx< _Tp, n, nm > &vt, const Matx< _Tp, m, nb > &rhs, Matx< _Tp, n, nb > &dst)']]], - ['backward_2fhashtable_2eh_40',['backward/hashtable.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16946.html',1,'']]], - ['backward_5fwarning_2eh_41',['backward_warning.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00731.html',1,'']]], - ['bad_42',['bad',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'basic_ios< char, _Traits >::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'basic_iostream< char >::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'basic_istream< char >::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'basic_istream< char, _Traits >::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'basic_ostream< char >::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'basic_ostream< char, _Traits >::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_fstream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_ifstream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_ios::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_iostream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_istream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_istringstream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_ofstream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_ostream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_ostringstream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_stringstream::bad()']]], - ['bad_5falloc_43',['bad_alloc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01667.html',1,'std']]], - ['bad_5fany_5fcast_44',['bad_any_cast',['https://docs.opencv.org/4.2.0/dc/d1b/classcv_1_1util_1_1bad__any__cast.html',1,'cv::util::bad_any_cast'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09959.html',1,'std::experimental::fundamentals_v1::bad_any_cast']]], - ['bad_5fcast_45',['bad_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01683.html',1,'std']]], + ['backends_20registry_14',['Query I/O API backends registry',['https://docs.opencv.org/4.2.0/de/db1/group__videoio__registry.html',1,'']]], + ['backendwrapper_15',['BackendWrapper',['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html',1,'cv::dnn::BackendWrapper'],['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#a523b1266b28c68bf80153fe1cce064fc',1,'cv::dnn::BackendWrapper::BackendWrapper(int backendId, int targetId)'],['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#a4f78e2ddc8f0aeadfc1ae173cc279e3e',1,'cv::dnn::BackendWrapper::BackendWrapper(int targetId, const cv::Mat &m)'],['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#aba12624858d3e17d6702d0e4061d9e65',1,'cv::dnn::BackendWrapper::BackendWrapper(const Ptr< BackendWrapper > &base, const MatShape &shape)']]], + ['background_16',['background',['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#a8050ffa819ecda412bb219d8044ced22',1,'cv::datasets::GR_skigObj']]], + ['background_20foreground_20segmentation_20methods_17',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], + ['background_20segmentation_18',['Background Segmentation',['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html',1,'']]], + ['background_20subtraction_19',['Background Subtraction',['https://docs.opencv.org/4.2.0/db/d5c/tutorial_py_bg_subtraction.html',1,'Background Subtraction'],['https://docs.opencv.org/4.2.0/de/df4/tutorial_js_bg_subtraction.html',1,'Background Subtraction'],['https://docs.opencv.org/4.2.0/d8/d38/tutorial_bgsegm_bg_subtraction.html',1,'Background Subtraction']]], + ['background_20subtraction_20methods_20',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], + ['background_5fratio_21',['background_ratio',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#add9a220079347042688a79d2d0fba5b1',1,'cv::TrackerCSRT::Params']]], + ['background_5fsegm_2ehpp_22',['background_segm.hpp',['https://docs.opencv.org/4.2.0/db/d73/background__segm_8hpp.html',1,'']]], + ['background_5fsubtraction_2emarkdown_23',['background_subtraction.markdown',['https://docs.opencv.org/4.2.0/d1/d6d/background__subtraction_8markdown.html',1,'']]], + ['backgroundsubtractor_24',['BackgroundSubtractor',['https://docs.opencv.org/4.2.0/d7/df6/classcv_1_1BackgroundSubtractor.html',1,'cv']]], + ['backgroundsubtractorcnt_25',['BackgroundSubtractorCNT',['https://docs.opencv.org/4.2.0/de/dca/classcv_1_1bgsegm_1_1BackgroundSubtractorCNT.html',1,'cv::bgsegm']]], + ['backgroundsubtractorfgd_26',['BackgroundSubtractorFGD',['https://docs.opencv.org/4.2.0/d3/dd2/classcv_1_1cuda_1_1BackgroundSubtractorFGD.html',1,'cv::cuda']]], + ['backgroundsubtractorgmg_27',['BackgroundSubtractorGMG',['https://docs.opencv.org/4.2.0/d1/d5c/classcv_1_1bgsegm_1_1BackgroundSubtractorGMG.html',1,'cv::bgsegm::BackgroundSubtractorGMG'],['https://docs.opencv.org/4.2.0/d5/df2/classcv_1_1cuda_1_1BackgroundSubtractorGMG.html',1,'cv::cuda::BackgroundSubtractorGMG']]], + ['backgroundsubtractorgsoc_28',['BackgroundSubtractorGSOC',['https://docs.opencv.org/4.2.0/d4/dd5/classcv_1_1bgsegm_1_1BackgroundSubtractorGSOC.html',1,'cv::bgsegm']]], + ['backgroundsubtractorknn_29',['BackgroundSubtractorKNN',['https://docs.opencv.org/4.2.0/db/d88/classcv_1_1BackgroundSubtractorKNN.html',1,'cv']]], + ['backgroundsubtractorlsbp_30',['BackgroundSubtractorLSBP',['https://docs.opencv.org/4.2.0/de/d4c/classcv_1_1bgsegm_1_1BackgroundSubtractorLSBP.html',1,'cv::bgsegm']]], + ['backgroundsubtractorlsbpdesc_31',['BackgroundSubtractorLSBPDesc',['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1bgsegm_1_1BackgroundSubtractorLSBPDesc.html',1,'cv::bgsegm']]], + ['backgroundsubtractormog_32',['BackgroundSubtractorMOG',['https://docs.opencv.org/4.2.0/d6/da7/classcv_1_1bgsegm_1_1BackgroundSubtractorMOG.html',1,'cv::bgsegm::BackgroundSubtractorMOG'],['https://docs.opencv.org/4.2.0/d1/dfe/classcv_1_1cuda_1_1BackgroundSubtractorMOG.html',1,'cv::cuda::BackgroundSubtractorMOG']]], + ['backgroundsubtractormog2_33',['BackgroundSubtractorMOG2',['https://docs.opencv.org/4.2.0/d7/d7b/classcv_1_1BackgroundSubtractorMOG2.html',1,'cv::BackgroundSubtractorMOG2'],['https://docs.opencv.org/4.2.0/df/d23/classcv_1_1cuda_1_1BackgroundSubtractorMOG2.html',1,'cv::cuda::BackgroundSubtractorMOG2']]], + ['backgroundtype_34',['backgroundType',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gaf7e286a941a896732aa34847bab9b182',1,'cv::datasets::backgroundType'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gaf7e286a941a896732aa34847bab9b182',1,'backgroundType(Global Namespace)']]], + ['backproject_35',['backProject',['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a5f84cfbdb25b9833cc1bfb5bd484ea79',1,'cv::PCA::backProject(InputArray vec) const'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a3b2dae725800de973be1135e92b1686a',1,'cv::PCA::backProject(InputArray vec, OutputArray result) const']]], + ['backprojection_36',['Backprojection',['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_histogram_backprojection.html',1,'Histogram - 3 : Histogram Backprojection'],['https://docs.opencv.org/4.2.0/dc/df6/tutorial_py_histogram_backprojection.html',1,'Histogram - 4 : Histogram Backprojection']]], + ['backprop_37',['BACKPROP',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a012b34ee340b5d4d11b6844e12816181aaca348d78617e21b3fad5cc4c27e7889',1,'cv::ml::ANN_MLP']]], + ['backsubst_38',['backSubst',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a9d50bc1c641fdeff7543197d5a4f3b3d',1,'cv::SVD::backSubst(InputArray rhs, OutputArray dst) const'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a7c28935c9999977dbe34285d13d43190',1,'cv::SVD::backSubst(InputArray w, InputArray u, InputArray vt, InputArray rhs, OutputArray dst)'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#ae398d073d71188ed3e18ef27801b43b8',1,'cv::SVD::backSubst(const Matx< _Tp, nm, 1 > &w, const Matx< _Tp, m, nm > &u, const Matx< _Tp, n, nm > &vt, const Matx< _Tp, m, nb > &rhs, Matx< _Tp, n, nb > &dst)']]], + ['backward_2fhashtable_2eh_39',['backward/hashtable.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16946.html',1,'']]], + ['backward_5fwarning_2eh_40',['backward_warning.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00731.html',1,'']]], + ['bad_41',['bad',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'basic_ios< char, _Traits >::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'basic_iostream< char >::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'basic_istream< char >::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'basic_istream< char, _Traits >::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'basic_ostream< char >::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'basic_ostream< char, _Traits >::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_fstream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_ifstream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_ios::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_iostream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_istream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_istringstream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_ofstream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_ostream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_ostringstream::bad()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ad79b64356f78198654c36480f670738c',1,'std::basic_stringstream::bad()']]], + ['bad_5falloc_42',['bad_alloc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01667.html',1,'std']]], + ['bad_5fany_5fcast_43',['bad_any_cast',['https://docs.opencv.org/4.2.0/dc/d1b/classcv_1_1util_1_1bad__any__cast.html',1,'cv::util::bad_any_cast'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09959.html',1,'std::experimental::fundamentals_v1::bad_any_cast']]], + ['bad_5fcast_44',['bad_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01683.html',1,'std']]], + ['bad_5fdatapoint_5faccess_45',['bad_datapoint_access',['../classrobot_1_1types_1_1bad__datapoint__access.html',1,'robot::types']]], ['bad_5fexception_46',['bad_exception',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01659.html',1,'std']]], ['bad_5ffunction_5fcall_47',['bad_function_call',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07119.html',1,'std']]], ['bad_5foptional_5faccess_48',['bad_optional_access',['https://docs.opencv.org/4.2.0/dd/dd6/classcv_1_1util_1_1bad__optional__access.html',1,'cv::util::bad_optional_access'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10083.html',1,'std::experimental::fundamentals_v1::bad_optional_access']]], @@ -485,8 +485,8 @@ var searchData= ['bits_2fshared_5fptr_2eh_482',['bits/shared_ptr.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17228.html',1,'']]], ['bits_2fstl_5fiterator_2eh_483',['bits/stl_iterator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17261.html',1,'']]], ['bits_2fstring_5fview_2etcc_484',['bits/string_view.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17273.html',1,'']]], - ['bitset_485',['bitset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08831.html',1,'std::__debug::bitset< _Nb >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09099.html',1,'std::__profile::bitset< _Nb >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html',1,'std::bitset< _Nb >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00047.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a5151bbfc506a4e67b62aad88858087bf',1,'std::bitset::bitset() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac9ff38d14bbdb04b227c153e599ea2a3',1,'std::bitset::bitset(unsigned long long __val) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a8d5bd427a29860ac451ffe8a8d4ad40e',1,'std::bitset::bitset(const std::basic_string< _CharT, _Traits, _Alloc > &__s, size_t __position=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aad1e618ff42ed7383899856a0c0043f4',1,'std::bitset::bitset(const std::basic_string< _CharT, _Traits, _Alloc > &__s, size_t __position, size_t __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a68b8f8604acc020e65bec91099f31eb3',1,'std::bitset::bitset(const _CharT *__str, typename std::basic_string< _CharT >::size_type __n=std::basic_string< _CharT >::npos, _CharT __zero=_CharT( '0'), _CharT __one=_CharT( '1'))']]], - ['bitset_486',['Dynamic Bitset.',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html',1,'']]], + ['bitset_485',['Dynamic Bitset.',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html',1,'']]], + ['bitset_486',['bitset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08831.html',1,'std::__debug::bitset< _Nb >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09099.html',1,'std::__profile::bitset< _Nb >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html',1,'std::bitset< _Nb >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00047.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a5151bbfc506a4e67b62aad88858087bf',1,'std::bitset::bitset() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac9ff38d14bbdb04b227c153e599ea2a3',1,'std::bitset::bitset(unsigned long long __val) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a8d5bd427a29860ac451ffe8a8d4ad40e',1,'std::bitset::bitset(const std::basic_string< _CharT, _Traits, _Alloc > &__s, size_t __position=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aad1e618ff42ed7383899856a0c0043f4',1,'std::bitset::bitset(const std::basic_string< _CharT, _Traits, _Alloc > &__s, size_t __position, size_t __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a68b8f8604acc020e65bec91099f31eb3',1,'std::bitset::bitset(const _CharT *__str, typename std::basic_string< _CharT >::size_type __n=std::basic_string< _CharT >::npos, _CharT __zero=_CharT( '0'), _CharT __one=_CharT( '1'))']]], ['bitset_3c_20n_5flimit_5fswitch_20_3e_487',['bitset< N_LIMIT_SWITCH >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html',1,'std']]], ['bitwise_20logical_20operations_488',['Bitwise logical operations',['https://docs.opencv.org/4.2.0/d2/d18/group__core__hal__interface__logical.html',1,'']]], ['bitwise_5fand_489',['bitwise_and',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga60b4d04b251ba5eb1392c34425497e14',1,'cv::bitwise_and()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga78d7c1a013877abd4237fbfc4e13bd76',1,'cv::cuda::bitwise_and()'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga0b865f60a0cc59f848b09e6a3ca0cc55',1,'cv::gapi::bitwise_and(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaaa5d96258439a172036384bbce5420a8',1,'cv::gapi::bitwise_and(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga60b4d04b251ba5eb1392c34425497e14',1,'bitwise_and(InputArray src1, InputArray src2, OutputArray dst, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga0b865f60a0cc59f848b09e6a3ca0cc55',1,'bitwise_and(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaaa5d96258439a172036384bbce5420a8',1,'bitwise_and(const GMat &src1, const GScalar &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga78d7c1a013877abd4237fbfc4e13bd76',1,'bitwise_and(InputArray src1, InputArray src2, OutputArray dst, InputArray mask=noArray(), Stream &stream=Stream::Null())(Global Namespace)']]], @@ -512,182 +512,183 @@ var searchData= ['block_2ehpp_509',['block.hpp',['https://docs.opencv.org/4.2.0/d3/d30/modules_2core_2include_2opencv2_2core_2cuda_2block_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/db0/contrib_2modules_2cudev_2include_2opencv2_2cudev_2block_2block_8hpp.html',1,'(Global Namespace)']]], ['block_3c_20const_20eigen_3a_3amatrix_2c_20ambientdimatcompiletime_2c_201_20_3e_510',['Block< const Eigen::Matrix, AmbientDimAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'']]], ['block_3c_20constmatrixtype_2c_20dim_2c_201_2c_21_28internal_3a_3atraits_3c_20eigen_3a_3amatrix_20_3e_3a_3aflags_20_26rowmajorbit_29_3e_511',['Block< ConstMatrixType, Dim, 1,!(internal::traits< Eigen::Matrix >::Flags &RowMajorBit)>',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'']]], - ['block_3c_20constmatrixtype_2c_20dim_2c_20dim_2c_20int_28mode_29_3d_3d_28affinecompact_29_20_26_26_28int_28options_29_26rowmajor_29_3d_3d0_20_3e_512',['Block< ConstMatrixType, Dim, Dim, int(Mode)==(AffineCompact) &&(int(Options)&RowMajor)==0 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'']]], - ['block_3c_20vectortype_2c_20internal_3a_3atraits_3c_20vectortype_20_3e_3a_3aflags_20_26rowmajorbit_20_3f_201_20_3asize_2c_20internal_3a_3atraits_3c_20vectortype_20_3e_3a_3aflags_20_26rowmajorbit_20_3f_20size_20_3a1_20_3e_513',['Block< VectorType, internal::traits< VectorType >::Flags &RowMajorBit ? 1 :Size, internal::traits< VectorType >::Flags &RowMajorBit ? Size :1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'']]], - ['block_5fdim_5fy_514',['block_dim_y',['https://docs.opencv.org/4.2.0/dd/d44/structcv_1_1cudev_1_1DefaultTransposePolicy.html#aca437e2aaa4d2102c3d7299ff8e14b4dafb9af4fbd8d4ae46d03dd39cfce7a37b',1,'cv::cudev::DefaultTransposePolicy']]], - ['block_5fmean_5fhash_2ehpp_515',['block_mean_hash.hpp',['https://docs.opencv.org/4.2.0/d8/d87/block__mean__hash_8hpp.html',1,'']]], - ['block_5fmean_5fhash_5fmode_5f0_516',['BLOCK_MEAN_HASH_MODE_0',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gga2f6c70af3b4924b4eea07cfa25ce0962a6f674fdb0f63d5d2f927cafbbf7f2707',1,'cv::img_hash::BLOCK_MEAN_HASH_MODE_0'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gga2f6c70af3b4924b4eea07cfa25ce0962a6f674fdb0f63d5d2f927cafbbf7f2707',1,'BLOCK_MEAN_HASH_MODE_0(Global Namespace)']]], - ['block_5fmean_5fhash_5fmode_5f1_517',['BLOCK_MEAN_HASH_MODE_1',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gga2f6c70af3b4924b4eea07cfa25ce0962acd4cad53c6ffadcceffdf145c2039859',1,'cv::img_hash::BLOCK_MEAN_HASH_MODE_1'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gga2f6c70af3b4924b4eea07cfa25ce0962acd4cad53c6ffadcceffdf145c2039859',1,'BLOCK_MEAN_HASH_MODE_1(Global Namespace)']]], - ['block_5fsize_5fx_518',['block_size_x',['https://docs.opencv.org/4.2.0/d8/dc2/structcv_1_1cudev_1_1DefaultCopyPolicy.html#ad4ebd6532290c3aa582bb4f40c8a9515ad66c298b22c4f216e9b222d9f09f659f',1,'cv::cudev::DefaultCopyPolicy::block_size_x'],['https://docs.opencv.org/4.2.0/d2/d04/structcv_1_1cudev_1_1DefaultGlobReducePolicy.html#a1ad0902ac493453c5843538f7fc0ded7adfb2b55fe656787b7f509cc4667a280d',1,'cv::cudev::DefaultGlobReducePolicy::block_size_x'],['https://docs.opencv.org/4.2.0/d4/d2b/structcv_1_1cudev_1_1DefaultHistogramPolicy.html#a4d5b2f67dab1e0dcdd70f8e5bbdca2b3a715251381159b6869f2ac3471a1dc08f',1,'cv::cudev::DefaultHistogramPolicy::block_size_x'],['https://docs.opencv.org/4.2.0/d3/dd7/structcv_1_1cudev_1_1DefaultReduceToVecPolicy.html#acf366fdba03f0fd26c5ce99b2e710d54a660adc1ec2866c95864546fc6cc582d5',1,'cv::cudev::DefaultReduceToVecPolicy::block_size_x'],['https://docs.opencv.org/4.2.0/d9/d3a/structcv_1_1cudev_1_1DefaultSplitMergePolicy.html#a20a04b9b1e86244274d59ffcaad0db8fab44a6a7cbf65adaca7185690e1bc2790',1,'cv::cudev::DefaultSplitMergePolicy::block_size_x'],['https://docs.opencv.org/4.2.0/db/db3/structcv_1_1cudev_1_1DefaultTransformPolicy.html#a8c19f9716033eac39284b9f6a525ac16a84b40dc5871a4dbb02ccf4fb196813d1',1,'cv::cudev::DefaultTransformPolicy::block_size_x']]], - ['block_5fsize_5fy_519',['block_size_y',['https://docs.opencv.org/4.2.0/d8/dc2/structcv_1_1cudev_1_1DefaultCopyPolicy.html#ad4ebd6532290c3aa582bb4f40c8a9515a430d22c787429db6945c93a2ddac71a4',1,'cv::cudev::DefaultCopyPolicy::block_size_y'],['https://docs.opencv.org/4.2.0/d2/d04/structcv_1_1cudev_1_1DefaultGlobReducePolicy.html#a1ad0902ac493453c5843538f7fc0ded7a8fdc3b5cd2fe90c6ad42c43a8755a732',1,'cv::cudev::DefaultGlobReducePolicy::block_size_y'],['https://docs.opencv.org/4.2.0/d4/d2b/structcv_1_1cudev_1_1DefaultHistogramPolicy.html#a4d5b2f67dab1e0dcdd70f8e5bbdca2b3a4164d39ebe1c7b0aec837bfb2845f888',1,'cv::cudev::DefaultHistogramPolicy::block_size_y'],['https://docs.opencv.org/4.2.0/d3/dd7/structcv_1_1cudev_1_1DefaultReduceToVecPolicy.html#acf366fdba03f0fd26c5ce99b2e710d54a1e7fda953edbc5f72fcf8543c529e011',1,'cv::cudev::DefaultReduceToVecPolicy::block_size_y'],['https://docs.opencv.org/4.2.0/d9/d3a/structcv_1_1cudev_1_1DefaultSplitMergePolicy.html#a20a04b9b1e86244274d59ffcaad0db8fa2e4790ff6b5281896cfb668ce082e789',1,'cv::cudev::DefaultSplitMergePolicy::block_size_y'],['https://docs.opencv.org/4.2.0/db/db3/structcv_1_1cudev_1_1DefaultTransformPolicy.html#a8c19f9716033eac39284b9f6a525ac16a108871bd16e9cf0d5444bf838a40ffc3',1,'cv::cudev::DefaultTransformPolicy::block_size_y']]], - ['blockagregation_520',['blockAgregation',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a96964d9789e3b0e0456b02cdfb22b553',1,'cv::stereo::Matching']]], - ['blockcopy_521',['blockCopy',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf51cc0418583d154ca8154e948a9bd06',1,'cv::cudev::blockCopy()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf51cc0418583d154ca8154e948a9bd06',1,'blockCopy()(Global Namespace)']]], - ['blockfill_522',['blockFill',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16247ffa2276dffc70dd52bc61001eaa',1,'cv::cudev::blockFill()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16247ffa2276dffc70dd52bc61001eaa',1,'blockFill()(Global Namespace)']]], - ['blockid_523',['blockId',['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1Block.html#ad0cc0c3c4ed654db57e05322f02eb3c4',1,'cv::cudev::Block']]], - ['blockidx_524',['blockIdx',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a79b8df175f56f5a36509ce0d310b4039',1,'cv::FileNode::blockIdx'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ab7b41883712e01cfc8c7f09bc826863c',1,'cv::FileNodeIterator::blockIdx']]], - ['blockimpl_525',['BlockImpl',['https://eigen.tuxfamily.org/dox/classEigen_1_1BlockImpl_3_01XprType_00_01BlockRows_00_01BlockCols_00_01InnerPanel_00_01Sparse_01_4.html#aa724feeda73e4d5d2330c6dced2d18f9',1,'Eigen::BlockImpl< XprType, BlockRows, BlockCols, InnerPanel, Sparse >::BlockImpl(XprType &xpr, Index i)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1BlockImpl_3_01XprType_00_01BlockRows_00_01BlockCols_00_01InnerPanel_00_01Sparse_01_4.html#a2fe461bd49f27e586b7d0e652e370644',1,'Eigen::BlockImpl< XprType, BlockRows, BlockCols, InnerPanel, Sparse >::BlockImpl(XprType &xpr, Index startRow, Index startCol, Index blockRows, Index blockCols)']]], - ['blockimpl_3c_20xprtype_2c_20blockrows_2c_20blockcols_2c_20innerpanel_2c_20sparse_20_3e_526',['BlockImpl< XprType, BlockRows, BlockCols, InnerPanel, Sparse >',['https://eigen.tuxfamily.org/dox/classEigen_1_1BlockImpl_3_01XprType_00_01BlockRows_00_01BlockCols_00_01InnerPanel_00_01Sparse_01_4.html',1,'Eigen']]], - ['blocking_5fsync_527',['BLOCKING_SYNC',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa912544338415c5f8c8e55e85a139bfba630dfc7cde70804f12bd1efd04e30ebe',1,'cv::cuda::Event']]], - ['blockmeanhash_528',['BlockMeanHash',['https://docs.opencv.org/4.2.0/df/d55/classcv_1_1img__hash_1_1BlockMeanHash.html',1,'cv::img_hash::BlockMeanHash'],['https://docs.opencv.org/4.2.0/df/d55/classcv_1_1img__hash_1_1BlockMeanHash.html#a17c58dfc411daac7fe41809baa1b68c6',1,'cv::img_hash::BlockMeanHash::BlockMeanHash()']]], - ['blockmeanhash_529',['blockMeanHash',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga33aaedc557653d1d541a78bbc119b116',1,'cv::img_hash::blockMeanHash()'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga33aaedc557653d1d541a78bbc119b116',1,'blockMeanHash()(Global Namespace)']]], - ['blockmeanhashmode_530',['BlockMeanHashMode',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga2f6c70af3b4924b4eea07cfa25ce0962',1,'cv::img_hash::BlockMeanHashMode'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga2f6c70af3b4924b4eea07cfa25ce0962',1,'BlockMeanHashMode(Global Namespace)']]], - ['blockreduce_531',['blockReduce',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3619872ab552bec4e3574fb745b91a79',1,'cv::cudev::blockReduce(volatile T *smem, T &val, uint tid, const Op &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7d95201665ef53994d51238f498ef82',1,'cv::cudev::blockReduce(const tuple< P0, P1, P2, P3, P4, P5, P6, P7, P8, P9 > &smem, const tuple< R0, R1, R2, R3, R4, R5, R6, R7, R8, R9 > &val, uint tid, const tuple< Op0, Op1, Op2, Op3, Op4, Op5, Op6, Op7, Op8, Op9 > &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3619872ab552bec4e3574fb745b91a79',1,'blockReduce(volatile T *smem, T &val, uint tid, const Op &op)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7d95201665ef53994d51238f498ef82',1,'blockReduce(const tuple< P0, P1, P2, P3, P4, P5, P6, P7, P8, P9 > &smem, const tuple< R0, R1, R2, R3, R4, R5, R6, R7, R8, R9 > &val, uint tid, const tuple< Op0, Op1, Op2, Op3, Op4, Op5, Op6, Op7, Op8, Op9 > &op)(Global Namespace)']]], - ['blockreducekeyval_532',['blockReduceKeyVal',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08aa4a9e614ecea0903a2509a71e1ca6',1,'cv::cudev::blockReduceKeyVal(volatile K *skeys, K &key, volatile V *svals, V &val, uint tid, const Cmp &cmp)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fc18b174244808f48159b8979ad5aeb',1,'cv::cudev::blockReduceKeyVal(volatile K *skeys, K &key, const tuple< VP0, VP1, VP2, VP3, VP4, VP5, VP6, VP7, VP8, VP9 > &svals, const tuple< VR0, VR1, VR2, VR3, VR4, VR5, VR6, VR7, VR8, VR9 > &val, uint tid, const Cmp &cmp)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b390c66efa4cf37a68e76df6149a39b',1,'cv::cudev::blockReduceKeyVal(const tuple< KP0, KP1, KP2, KP3, KP4, KP5, KP6, KP7, KP8, KP9 > &skeys, const tuple< KR0, KR1, KR2, KR3, KR4, KR5, KR6, KR7, KR8, KR9 > &key, const tuple< VP0, VP1, VP2, VP3, VP4, VP5, VP6, VP7, VP8, VP9 > &svals, const tuple< VR0, VR1, VR2, VR3, VR4, VR5, VR6, VR7, VR8, VR9 > &val, uint tid, const tuple< Cmp0, Cmp1, Cmp2, Cmp3, Cmp4, Cmp5, Cmp6, Cmp7, Cmp8, Cmp9 > &cmp)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08aa4a9e614ecea0903a2509a71e1ca6',1,'blockReduceKeyVal(volatile K *skeys, K &key, volatile V *svals, V &val, uint tid, const Cmp &cmp)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fc18b174244808f48159b8979ad5aeb',1,'blockReduceKeyVal(volatile K *skeys, K &key, const tuple< VP0, VP1, VP2, VP3, VP4, VP5, VP6, VP7, VP8, VP9 > &svals, const tuple< VR0, VR1, VR2, VR3, VR4, VR5, VR6, VR7, VR8, VR9 > &val, uint tid, const Cmp &cmp)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b390c66efa4cf37a68e76df6149a39b',1,'blockReduceKeyVal(const tuple< KP0, KP1, KP2, KP3, KP4, KP5, KP6, KP7, KP8, KP9 > &skeys, const tuple< KR0, KR1, KR2, KR3, KR4, KR5, KR6, KR7, KR8, KR9 > &key, const tuple< VP0, VP1, VP2, VP3, VP4, VP5, VP6, VP7, VP8, VP9 > &svals, const tuple< VR0, VR1, VR2, VR3, VR4, VR5, VR6, VR7, VR8, VR9 > &val, uint tid, const tuple< Cmp0, Cmp1, Cmp2, Cmp3, Cmp4, Cmp5, Cmp6, Cmp7, Cmp8, Cmp9 > &cmp)(Global Namespace)']]], - ['blockscanexclusive_533',['blockScanExclusive',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98d2dda8f9f87e0c18b371ef7814675',1,'cv::cudev::blockScanExclusive()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98d2dda8f9f87e0c18b371ef7814675',1,'blockScanExclusive()(Global Namespace)']]], - ['blockscaninclusive_534',['blockScanInclusive',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43050cdddfb9074c3ea2052731bd7499',1,'cv::cudev::blockScanInclusive()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43050cdddfb9074c3ea2052731bd7499',1,'blockScanInclusive()(Global Namespace)']]], - ['blockschannelscompensator_535',['BlocksChannelsCompensator',['https://docs.opencv.org/4.2.0/d3/dab/classcv_1_1detail_1_1BlocksChannelsCompensator.html',1,'cv::detail::BlocksChannelsCompensator'],['https://docs.opencv.org/4.2.0/d3/dab/classcv_1_1detail_1_1BlocksChannelsCompensator.html#a2a16b264f8d1cb30974c543804d4bc7b',1,'cv::detail::BlocksChannelsCompensator::BlocksChannelsCompensator()']]], - ['blockscompensator_536',['BlocksCompensator',['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html',1,'cv::detail::BlocksCompensator'],['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a2b863a7291d8b4004da8d2205b71f5a7',1,'cv::detail::BlocksCompensator::BlocksCompensator()']]], - ['blocksgaincompensator_537',['BlocksGainCompensator',['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html',1,'cv::detail::BlocksGainCompensator'],['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html#a51f8b3895b04b90a79457b7b552db220',1,'cv::detail::BlocksGainCompensator::BlocksGainCompensator(int bl_width=32, int bl_height=32)'],['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html#abca43fc0a398de6c15112f045360a9d1',1,'cv::detail::BlocksGainCompensator::BlocksGainCompensator(int bl_width, int bl_height, int nr_feeds)']]], - ['blocksize_538',['blockSize',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#aa6d3b51fb9022e4e3bc3f6b078f04003',1,'cv::FileNodeIterator::blockSize'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a847f3d42f1cf72897d5263fe3217a36d',1,'cv::HOGDescriptor::blockSize'],['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1Block.html#aced8f8d7740e8fd062d588358e0d670a',1,'cv::cudev::Block::blockSize()']]], - ['blockstride_539',['blockStride',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#ac272d532e2a672f302e9a5eab7ca1055',1,'cv::HOGDescriptor']]], - ['blocktransform_540',['blockTransform',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacce1f8bac1892b679a83a06764495325',1,'cv::cudev::blockTransform(InIt beg, InIt end, OutIt out, const UnOp &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7314bc01acd44aee835176b8d0525794',1,'cv::cudev::blockTransform(InIt1 beg1, InIt1 end1, InIt2 beg2, OutIt out, const BinOp &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacce1f8bac1892b679a83a06764495325',1,'blockTransform(InIt beg, InIt end, OutIt out, const UnOp &op)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7314bc01acd44aee835176b8d0525794',1,'blockTransform(InIt1 beg1, InIt1 end1, InIt2 beg2, OutIt out, const BinOp &op)(Global Namespace)']]], - ['blockyota_541',['blockYota',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa11b77662eec5df369ae62e753242fbe',1,'cv::cudev::blockYota()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa11b77662eec5df369ae62e753242fbe',1,'blockYota()(Global Namespace)']]], - ['bluberry_542',['bluberry',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#aed6a33c6e7f8e8f93ddab6c13a4db5cc',1,'cv::viz::Color']]], - ['blue_543',['blue',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a7b7b90d7bb2994782725c55e70d7f83f',1,'cv::viz::Color']]], - ['bluenorm_544',['blueNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3f3faa00163c16824ff03e58a210c74c',1,'Eigen::MatrixBase::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3f3faa00163c16824ff03e58a210c74c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3f3faa00163c16824ff03e58a210c74c',1,'MatrixBase< Solve< Decomposition, RhsType > >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'Eigen::VectorwiseOp::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const Derived, Horizontal >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const Derived, Vertical >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::blueNorm()']]], - ['blur_545',['blur',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga8c45db9afe636703801b0b2e440fce37',1,'cv::blur()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gae50f1db53f567b9c846851c6e0d81849',1,'cv::gapi::blur()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga8c45db9afe636703801b0b2e440fce37',1,'blur(InputArray src, OutputArray dst, Size ksize, Point anchor=Point(-1,-1), int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gae50f1db53f567b9c846851c6e0d81849',1,'blur(const GMat &src, const Size &ksize, const Point &anchor=Point(-1,-1), int borderType=BORDER_DEFAULT, const Scalar &borderValue=Scalar(0))(Global Namespace)']]], - ['blurrinessrates_546',['blurrinessRates',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a9ede9e5fe8b45ebb2e39700ec69f4977',1,'cv::videostab::DeblurerBase']]], - ['blurrinessrates_5f_547',['blurrinessRates_',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#ae51388d21bc3e0babf7fa32a1f0fded2',1,'cv::videostab::DeblurerBase::blurrinessRates_'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ad515524cacce64cea069d6d85ca85be5',1,'cv::videostab::StabilizerBase::blurrinessRates_']]], - ['bm3d_5fimage_5fdenoising_2ehpp_548',['bm3d_image_denoising.hpp',['https://docs.opencv.org/4.2.0/dd/dd5/bm3d__image__denoising_8hpp.html',1,'']]], - ['bm3d_5fstep1_549',['BM3D_STEP1',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gga2fc5a9661c1338a823fb3290673a880da0336e7fa2abd0b644fdd47466c4dc51f',1,'cv::xphoto::BM3D_STEP1'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gga2fc5a9661c1338a823fb3290673a880da0336e7fa2abd0b644fdd47466c4dc51f',1,'BM3D_STEP1(Global Namespace)']]], - ['bm3d_5fstep2_550',['BM3D_STEP2',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gga2fc5a9661c1338a823fb3290673a880da8bba899283ff32425773b96c8b577ed2',1,'cv::xphoto::BM3D_STEP2'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gga2fc5a9661c1338a823fb3290673a880da8bba899283ff32425773b96c8b577ed2',1,'BM3D_STEP2(Global Namespace)']]], - ['bm3d_5fstepall_551',['BM3D_STEPALL',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gga2fc5a9661c1338a823fb3290673a880da328ff1593300c0e4f7a2c5b7959528de',1,'cv::xphoto::BM3D_STEPALL'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gga2fc5a9661c1338a823fb3290673a880da328ff1593300c0e4f7a2c5b7959528de',1,'BM3D_STEPALL(Global Namespace)']]], - ['bm3ddenoising_552',['bm3dDenoising',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gadf4af6c1e77be6a1e243067b1291e1f6',1,'cv::xphoto::bm3dDenoising(InputArray src, InputOutputArray dstStep1, OutputArray dstStep2, float h=1, int templateWindowSize=4, int searchWindowSize=16, int blockMatchingStep1=2500, int blockMatchingStep2=400, int groupSize=8, int slidingStep=1, float beta=2.0f, int normType=cv::NORM_L2, int step=cv::xphoto::BM3D_STEPALL, int transformType=cv::xphoto::HAAR)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga467eecdf3ba4fc7abd0d2f3590ceee15',1,'cv::xphoto::bm3dDenoising(InputArray src, OutputArray dst, float h=1, int templateWindowSize=4, int searchWindowSize=16, int blockMatchingStep1=2500, int blockMatchingStep2=400, int groupSize=8, int slidingStep=1, float beta=2.0f, int normType=cv::NORM_L2, int step=cv::xphoto::BM3D_STEPALL, int transformType=cv::xphoto::HAAR)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gadf4af6c1e77be6a1e243067b1291e1f6',1,'bm3dDenoising(InputArray src, InputOutputArray dstStep1, OutputArray dstStep2, float h=1, int templateWindowSize=4, int searchWindowSize=16, int blockMatchingStep1=2500, int blockMatchingStep2=400, int groupSize=8, int slidingStep=1, float beta=2.0f, int normType=cv::NORM_L2, int step=cv::xphoto::BM3D_STEPALL, int transformType=cv::xphoto::HAAR)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga467eecdf3ba4fc7abd0d2f3590ceee15',1,'bm3dDenoising(InputArray src, OutputArray dst, float h=1, int templateWindowSize=4, int searchWindowSize=16, int blockMatchingStep1=2500, int blockMatchingStep2=400, int groupSize=8, int slidingStep=1, float beta=2.0f, int normType=cv::NORM_L2, int step=cv::xphoto::BM3D_STEPALL, int transformType=cv::xphoto::HAAR)(Global Namespace)']]], - ['bm3dsteps_553',['Bm3dSteps',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga2fc5a9661c1338a823fb3290673a880d',1,'cv::xphoto::Bm3dSteps'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga2fc5a9661c1338a823fb3290673a880d',1,'Bm3dSteps(Global Namespace)']]], - ['bndboxes_554',['bndboxes',['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1datasets_1_1PD__inriaObj.html#a9b1f736326cce192d3e9efc7e43c406c',1,'cv::datasets::PD_inriaObj']]], - ['bneedstiltedii_555',['bNeedsTiltedII',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#a7c6683275d2dab4ae553d41f3c8b757e',1,'HaarClassifierCascadeDescriptor']]], - ['bnlllayer_556',['BNLLLayer',['https://docs.opencv.org/4.2.0/d0/d87/classcv_1_1dnn_1_1BNLLLayer.html',1,'cv::dnn']]], - ['board_557',['Board',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1aruco_1_1Board.html',1,'cv::aruco']]], - ['boards_558',['Detection of ArUco Boards',['https://docs.opencv.org/4.2.0/db/da9/tutorial_aruco_board_detection.html',1,'']]], - ['body_559',['body',['https://docs.opencv.org/4.2.0/de/dfb/structcv_1_1cudev_1_1Expr.html#a01cf730d6629c55d44ba1d1e71f1028b',1,'cv::cudev::Expr']]], - ['bool_5fset_560',['bool_set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html',1,'std::tr2::bool_set'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00992.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#a0f07a0992a2bc62b7dbf3f7aa6a01d3d',1,'std::tr2::bool_set::bool_set()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#ab77298d8121ed18a24e80cd0e1d23232',1,'std::tr2::bool_set::bool_set(bool __t)']]], - ['bool_5fset_2etcc_561',['bool_set.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00986.html',1,'']]], - ['boolalpha_562',['boolalpha',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'basic_ios< char, _Traits >::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'basic_iostream< char >::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'basic_istream< char >::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'basic_istream< char, _Traits >::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'basic_ostream< char >::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'basic_ostream< char, _Traits >::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_fstream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_ifstream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_ios::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_iostream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_istream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_istringstream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_ofstream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_ostream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_ostringstream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_stringstream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::ios_base::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa4c577f2579fd31f7bb2bd4ae582d917',1,'std::boolalpha()']]], - ['boolean_563',['boolean',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a82ed080814fa656191a537284bb0c575.html#a82ed080814fa656191a537284bb0c575',1,'nlohmann::json_sax']]], + ['block_3c_20constmatrixtype_2c_20dim_2c_201_2c_21_28internal_3a_3atraits_3c_20matrixtype_20_3e_3a_3aflags_20_26rowmajorbit_29_3e_512',['Block< ConstMatrixType, Dim, 1,!(internal::traits< MatrixType >::Flags &RowMajorBit)>',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'Eigen']]], + ['block_3c_20constmatrixtype_2c_20dim_2c_20dim_2c_20int_28mode_29_3d_3d_28affinecompact_29_20_26_26_28int_28options_29_26rowmajor_29_3d_3d0_20_3e_513',['Block< ConstMatrixType, Dim, Dim, int(Mode)==(AffineCompact) &&(int(Options)&RowMajor)==0 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'Block< ConstMatrixType, Dim, Dim, int(Mode)==(AffineCompact) &&(int(Options)&RowMajor)==0 >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'Eigen::Block< ConstMatrixType, Dim, Dim, int(Mode)==(AffineCompact) &&(int(Options)&RowMajor)==0 >']]], + ['block_3c_20vectortype_2c_20internal_3a_3atraits_3c_20vectortype_20_3e_3a_3aflags_20_26rowmajorbit_20_3f_201_20_3asize_2c_20internal_3a_3atraits_3c_20vectortype_20_3e_3a_3aflags_20_26rowmajorbit_20_3f_20size_20_3a1_20_3e_514',['Block< VectorType, internal::traits< VectorType >::Flags &RowMajorBit ? 1 :Size, internal::traits< VectorType >::Flags &RowMajorBit ? Size :1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'']]], + ['block_5fdim_5fy_515',['block_dim_y',['https://docs.opencv.org/4.2.0/dd/d44/structcv_1_1cudev_1_1DefaultTransposePolicy.html#aca437e2aaa4d2102c3d7299ff8e14b4dafb9af4fbd8d4ae46d03dd39cfce7a37b',1,'cv::cudev::DefaultTransposePolicy']]], + ['block_5fmean_5fhash_2ehpp_516',['block_mean_hash.hpp',['https://docs.opencv.org/4.2.0/d8/d87/block__mean__hash_8hpp.html',1,'']]], + ['block_5fmean_5fhash_5fmode_5f0_517',['BLOCK_MEAN_HASH_MODE_0',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gga2f6c70af3b4924b4eea07cfa25ce0962a6f674fdb0f63d5d2f927cafbbf7f2707',1,'cv::img_hash::BLOCK_MEAN_HASH_MODE_0'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gga2f6c70af3b4924b4eea07cfa25ce0962a6f674fdb0f63d5d2f927cafbbf7f2707',1,'BLOCK_MEAN_HASH_MODE_0(Global Namespace)']]], + ['block_5fmean_5fhash_5fmode_5f1_518',['BLOCK_MEAN_HASH_MODE_1',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gga2f6c70af3b4924b4eea07cfa25ce0962acd4cad53c6ffadcceffdf145c2039859',1,'cv::img_hash::BLOCK_MEAN_HASH_MODE_1'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gga2f6c70af3b4924b4eea07cfa25ce0962acd4cad53c6ffadcceffdf145c2039859',1,'BLOCK_MEAN_HASH_MODE_1(Global Namespace)']]], + ['block_5fsize_5fx_519',['block_size_x',['https://docs.opencv.org/4.2.0/d8/dc2/structcv_1_1cudev_1_1DefaultCopyPolicy.html#ad4ebd6532290c3aa582bb4f40c8a9515ad66c298b22c4f216e9b222d9f09f659f',1,'cv::cudev::DefaultCopyPolicy::block_size_x'],['https://docs.opencv.org/4.2.0/d2/d04/structcv_1_1cudev_1_1DefaultGlobReducePolicy.html#a1ad0902ac493453c5843538f7fc0ded7adfb2b55fe656787b7f509cc4667a280d',1,'cv::cudev::DefaultGlobReducePolicy::block_size_x'],['https://docs.opencv.org/4.2.0/d4/d2b/structcv_1_1cudev_1_1DefaultHistogramPolicy.html#a4d5b2f67dab1e0dcdd70f8e5bbdca2b3a715251381159b6869f2ac3471a1dc08f',1,'cv::cudev::DefaultHistogramPolicy::block_size_x'],['https://docs.opencv.org/4.2.0/d3/dd7/structcv_1_1cudev_1_1DefaultReduceToVecPolicy.html#acf366fdba03f0fd26c5ce99b2e710d54a660adc1ec2866c95864546fc6cc582d5',1,'cv::cudev::DefaultReduceToVecPolicy::block_size_x'],['https://docs.opencv.org/4.2.0/d9/d3a/structcv_1_1cudev_1_1DefaultSplitMergePolicy.html#a20a04b9b1e86244274d59ffcaad0db8fab44a6a7cbf65adaca7185690e1bc2790',1,'cv::cudev::DefaultSplitMergePolicy::block_size_x'],['https://docs.opencv.org/4.2.0/db/db3/structcv_1_1cudev_1_1DefaultTransformPolicy.html#a8c19f9716033eac39284b9f6a525ac16a84b40dc5871a4dbb02ccf4fb196813d1',1,'cv::cudev::DefaultTransformPolicy::block_size_x']]], + ['block_5fsize_5fy_520',['block_size_y',['https://docs.opencv.org/4.2.0/d8/dc2/structcv_1_1cudev_1_1DefaultCopyPolicy.html#ad4ebd6532290c3aa582bb4f40c8a9515a430d22c787429db6945c93a2ddac71a4',1,'cv::cudev::DefaultCopyPolicy::block_size_y'],['https://docs.opencv.org/4.2.0/d2/d04/structcv_1_1cudev_1_1DefaultGlobReducePolicy.html#a1ad0902ac493453c5843538f7fc0ded7a8fdc3b5cd2fe90c6ad42c43a8755a732',1,'cv::cudev::DefaultGlobReducePolicy::block_size_y'],['https://docs.opencv.org/4.2.0/d4/d2b/structcv_1_1cudev_1_1DefaultHistogramPolicy.html#a4d5b2f67dab1e0dcdd70f8e5bbdca2b3a4164d39ebe1c7b0aec837bfb2845f888',1,'cv::cudev::DefaultHistogramPolicy::block_size_y'],['https://docs.opencv.org/4.2.0/d3/dd7/structcv_1_1cudev_1_1DefaultReduceToVecPolicy.html#acf366fdba03f0fd26c5ce99b2e710d54a1e7fda953edbc5f72fcf8543c529e011',1,'cv::cudev::DefaultReduceToVecPolicy::block_size_y'],['https://docs.opencv.org/4.2.0/d9/d3a/structcv_1_1cudev_1_1DefaultSplitMergePolicy.html#a20a04b9b1e86244274d59ffcaad0db8fa2e4790ff6b5281896cfb668ce082e789',1,'cv::cudev::DefaultSplitMergePolicy::block_size_y'],['https://docs.opencv.org/4.2.0/db/db3/structcv_1_1cudev_1_1DefaultTransformPolicy.html#a8c19f9716033eac39284b9f6a525ac16a108871bd16e9cf0d5444bf838a40ffc3',1,'cv::cudev::DefaultTransformPolicy::block_size_y']]], + ['blockagregation_521',['blockAgregation',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a96964d9789e3b0e0456b02cdfb22b553',1,'cv::stereo::Matching']]], + ['blockcopy_522',['blockCopy',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf51cc0418583d154ca8154e948a9bd06',1,'cv::cudev::blockCopy()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf51cc0418583d154ca8154e948a9bd06',1,'blockCopy()(Global Namespace)']]], + ['blockfill_523',['blockFill',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16247ffa2276dffc70dd52bc61001eaa',1,'cv::cudev::blockFill()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16247ffa2276dffc70dd52bc61001eaa',1,'blockFill()(Global Namespace)']]], + ['blockid_524',['blockId',['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1Block.html#ad0cc0c3c4ed654db57e05322f02eb3c4',1,'cv::cudev::Block']]], + ['blockidx_525',['blockIdx',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a79b8df175f56f5a36509ce0d310b4039',1,'cv::FileNode::blockIdx'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ab7b41883712e01cfc8c7f09bc826863c',1,'cv::FileNodeIterator::blockIdx']]], + ['blockimpl_526',['BlockImpl',['https://eigen.tuxfamily.org/dox/classEigen_1_1BlockImpl_3_01XprType_00_01BlockRows_00_01BlockCols_00_01InnerPanel_00_01Sparse_01_4.html#aa724feeda73e4d5d2330c6dced2d18f9',1,'Eigen::BlockImpl< XprType, BlockRows, BlockCols, InnerPanel, Sparse >::BlockImpl(XprType &xpr, Index i)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1BlockImpl_3_01XprType_00_01BlockRows_00_01BlockCols_00_01InnerPanel_00_01Sparse_01_4.html#a2fe461bd49f27e586b7d0e652e370644',1,'Eigen::BlockImpl< XprType, BlockRows, BlockCols, InnerPanel, Sparse >::BlockImpl(XprType &xpr, Index startRow, Index startCol, Index blockRows, Index blockCols)']]], + ['blockimpl_3c_20xprtype_2c_20blockrows_2c_20blockcols_2c_20innerpanel_2c_20sparse_20_3e_527',['BlockImpl< XprType, BlockRows, BlockCols, InnerPanel, Sparse >',['https://eigen.tuxfamily.org/dox/classEigen_1_1BlockImpl_3_01XprType_00_01BlockRows_00_01BlockCols_00_01InnerPanel_00_01Sparse_01_4.html',1,'Eigen']]], + ['blocking_5fsync_528',['BLOCKING_SYNC',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa912544338415c5f8c8e55e85a139bfba630dfc7cde70804f12bd1efd04e30ebe',1,'cv::cuda::Event']]], + ['blockmeanhash_529',['BlockMeanHash',['https://docs.opencv.org/4.2.0/df/d55/classcv_1_1img__hash_1_1BlockMeanHash.html',1,'cv::img_hash::BlockMeanHash'],['https://docs.opencv.org/4.2.0/df/d55/classcv_1_1img__hash_1_1BlockMeanHash.html#a17c58dfc411daac7fe41809baa1b68c6',1,'cv::img_hash::BlockMeanHash::BlockMeanHash()']]], + ['blockmeanhash_530',['blockMeanHash',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga33aaedc557653d1d541a78bbc119b116',1,'cv::img_hash::blockMeanHash()'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga33aaedc557653d1d541a78bbc119b116',1,'blockMeanHash()(Global Namespace)']]], + ['blockmeanhashmode_531',['BlockMeanHashMode',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga2f6c70af3b4924b4eea07cfa25ce0962',1,'cv::img_hash::BlockMeanHashMode'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#ga2f6c70af3b4924b4eea07cfa25ce0962',1,'BlockMeanHashMode(Global Namespace)']]], + ['blockreduce_532',['blockReduce',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3619872ab552bec4e3574fb745b91a79',1,'cv::cudev::blockReduce(volatile T *smem, T &val, uint tid, const Op &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7d95201665ef53994d51238f498ef82',1,'cv::cudev::blockReduce(const tuple< P0, P1, P2, P3, P4, P5, P6, P7, P8, P9 > &smem, const tuple< R0, R1, R2, R3, R4, R5, R6, R7, R8, R9 > &val, uint tid, const tuple< Op0, Op1, Op2, Op3, Op4, Op5, Op6, Op7, Op8, Op9 > &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3619872ab552bec4e3574fb745b91a79',1,'blockReduce(volatile T *smem, T &val, uint tid, const Op &op)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7d95201665ef53994d51238f498ef82',1,'blockReduce(const tuple< P0, P1, P2, P3, P4, P5, P6, P7, P8, P9 > &smem, const tuple< R0, R1, R2, R3, R4, R5, R6, R7, R8, R9 > &val, uint tid, const tuple< Op0, Op1, Op2, Op3, Op4, Op5, Op6, Op7, Op8, Op9 > &op)(Global Namespace)']]], + ['blockreducekeyval_533',['blockReduceKeyVal',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08aa4a9e614ecea0903a2509a71e1ca6',1,'cv::cudev::blockReduceKeyVal(volatile K *skeys, K &key, volatile V *svals, V &val, uint tid, const Cmp &cmp)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fc18b174244808f48159b8979ad5aeb',1,'cv::cudev::blockReduceKeyVal(volatile K *skeys, K &key, const tuple< VP0, VP1, VP2, VP3, VP4, VP5, VP6, VP7, VP8, VP9 > &svals, const tuple< VR0, VR1, VR2, VR3, VR4, VR5, VR6, VR7, VR8, VR9 > &val, uint tid, const Cmp &cmp)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b390c66efa4cf37a68e76df6149a39b',1,'cv::cudev::blockReduceKeyVal(const tuple< KP0, KP1, KP2, KP3, KP4, KP5, KP6, KP7, KP8, KP9 > &skeys, const tuple< KR0, KR1, KR2, KR3, KR4, KR5, KR6, KR7, KR8, KR9 > &key, const tuple< VP0, VP1, VP2, VP3, VP4, VP5, VP6, VP7, VP8, VP9 > &svals, const tuple< VR0, VR1, VR2, VR3, VR4, VR5, VR6, VR7, VR8, VR9 > &val, uint tid, const tuple< Cmp0, Cmp1, Cmp2, Cmp3, Cmp4, Cmp5, Cmp6, Cmp7, Cmp8, Cmp9 > &cmp)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08aa4a9e614ecea0903a2509a71e1ca6',1,'blockReduceKeyVal(volatile K *skeys, K &key, volatile V *svals, V &val, uint tid, const Cmp &cmp)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fc18b174244808f48159b8979ad5aeb',1,'blockReduceKeyVal(volatile K *skeys, K &key, const tuple< VP0, VP1, VP2, VP3, VP4, VP5, VP6, VP7, VP8, VP9 > &svals, const tuple< VR0, VR1, VR2, VR3, VR4, VR5, VR6, VR7, VR8, VR9 > &val, uint tid, const Cmp &cmp)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b390c66efa4cf37a68e76df6149a39b',1,'blockReduceKeyVal(const tuple< KP0, KP1, KP2, KP3, KP4, KP5, KP6, KP7, KP8, KP9 > &skeys, const tuple< KR0, KR1, KR2, KR3, KR4, KR5, KR6, KR7, KR8, KR9 > &key, const tuple< VP0, VP1, VP2, VP3, VP4, VP5, VP6, VP7, VP8, VP9 > &svals, const tuple< VR0, VR1, VR2, VR3, VR4, VR5, VR6, VR7, VR8, VR9 > &val, uint tid, const tuple< Cmp0, Cmp1, Cmp2, Cmp3, Cmp4, Cmp5, Cmp6, Cmp7, Cmp8, Cmp9 > &cmp)(Global Namespace)']]], + ['blockscanexclusive_534',['blockScanExclusive',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98d2dda8f9f87e0c18b371ef7814675',1,'cv::cudev::blockScanExclusive()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98d2dda8f9f87e0c18b371ef7814675',1,'blockScanExclusive()(Global Namespace)']]], + ['blockscaninclusive_535',['blockScanInclusive',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43050cdddfb9074c3ea2052731bd7499',1,'cv::cudev::blockScanInclusive()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43050cdddfb9074c3ea2052731bd7499',1,'blockScanInclusive()(Global Namespace)']]], + ['blockschannelscompensator_536',['BlocksChannelsCompensator',['https://docs.opencv.org/4.2.0/d3/dab/classcv_1_1detail_1_1BlocksChannelsCompensator.html',1,'cv::detail::BlocksChannelsCompensator'],['https://docs.opencv.org/4.2.0/d3/dab/classcv_1_1detail_1_1BlocksChannelsCompensator.html#a2a16b264f8d1cb30974c543804d4bc7b',1,'cv::detail::BlocksChannelsCompensator::BlocksChannelsCompensator()']]], + ['blockscompensator_537',['BlocksCompensator',['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html',1,'cv::detail::BlocksCompensator'],['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a2b863a7291d8b4004da8d2205b71f5a7',1,'cv::detail::BlocksCompensator::BlocksCompensator()']]], + ['blocksgaincompensator_538',['BlocksGainCompensator',['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html',1,'cv::detail::BlocksGainCompensator'],['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html#a51f8b3895b04b90a79457b7b552db220',1,'cv::detail::BlocksGainCompensator::BlocksGainCompensator(int bl_width=32, int bl_height=32)'],['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html#abca43fc0a398de6c15112f045360a9d1',1,'cv::detail::BlocksGainCompensator::BlocksGainCompensator(int bl_width, int bl_height, int nr_feeds)']]], + ['blocksize_539',['blockSize',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#aa6d3b51fb9022e4e3bc3f6b078f04003',1,'cv::FileNodeIterator::blockSize'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a847f3d42f1cf72897d5263fe3217a36d',1,'cv::HOGDescriptor::blockSize'],['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1Block.html#aced8f8d7740e8fd062d588358e0d670a',1,'cv::cudev::Block::blockSize()']]], + ['blockstride_540',['blockStride',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#ac272d532e2a672f302e9a5eab7ca1055',1,'cv::HOGDescriptor']]], + ['blocktransform_541',['blockTransform',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacce1f8bac1892b679a83a06764495325',1,'cv::cudev::blockTransform(InIt beg, InIt end, OutIt out, const UnOp &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7314bc01acd44aee835176b8d0525794',1,'cv::cudev::blockTransform(InIt1 beg1, InIt1 end1, InIt2 beg2, OutIt out, const BinOp &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacce1f8bac1892b679a83a06764495325',1,'blockTransform(InIt beg, InIt end, OutIt out, const UnOp &op)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7314bc01acd44aee835176b8d0525794',1,'blockTransform(InIt1 beg1, InIt1 end1, InIt2 beg2, OutIt out, const BinOp &op)(Global Namespace)']]], + ['blockyota_542',['blockYota',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa11b77662eec5df369ae62e753242fbe',1,'cv::cudev::blockYota()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa11b77662eec5df369ae62e753242fbe',1,'blockYota()(Global Namespace)']]], + ['bluberry_543',['bluberry',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#aed6a33c6e7f8e8f93ddab6c13a4db5cc',1,'cv::viz::Color']]], + ['blue_544',['blue',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a7b7b90d7bb2994782725c55e70d7f83f',1,'cv::viz::Color']]], + ['bluenorm_545',['blueNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3f3faa00163c16824ff03e58a210c74c',1,'Eigen::MatrixBase::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3f3faa00163c16824ff03e58a210c74c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3f3faa00163c16824ff03e58a210c74c',1,'MatrixBase< Solve< Decomposition, RhsType > >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'Eigen::VectorwiseOp::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const Derived, Horizontal >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const Derived, Vertical >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::blueNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a4d2fbc5296470a94379cbcb33bb9c24d',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::blueNorm()']]], + ['blur_546',['blur',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga8c45db9afe636703801b0b2e440fce37',1,'cv::blur()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gae50f1db53f567b9c846851c6e0d81849',1,'cv::gapi::blur()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga8c45db9afe636703801b0b2e440fce37',1,'blur(InputArray src, OutputArray dst, Size ksize, Point anchor=Point(-1,-1), int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gae50f1db53f567b9c846851c6e0d81849',1,'blur(const GMat &src, const Size &ksize, const Point &anchor=Point(-1,-1), int borderType=BORDER_DEFAULT, const Scalar &borderValue=Scalar(0))(Global Namespace)']]], + ['blurrinessrates_547',['blurrinessRates',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a9ede9e5fe8b45ebb2e39700ec69f4977',1,'cv::videostab::DeblurerBase']]], + ['blurrinessrates_5f_548',['blurrinessRates_',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#ae51388d21bc3e0babf7fa32a1f0fded2',1,'cv::videostab::DeblurerBase::blurrinessRates_'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ad515524cacce64cea069d6d85ca85be5',1,'cv::videostab::StabilizerBase::blurrinessRates_']]], + ['bm3d_5fimage_5fdenoising_2ehpp_549',['bm3d_image_denoising.hpp',['https://docs.opencv.org/4.2.0/dd/dd5/bm3d__image__denoising_8hpp.html',1,'']]], + ['bm3d_5fstep1_550',['BM3D_STEP1',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gga2fc5a9661c1338a823fb3290673a880da0336e7fa2abd0b644fdd47466c4dc51f',1,'cv::xphoto::BM3D_STEP1'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gga2fc5a9661c1338a823fb3290673a880da0336e7fa2abd0b644fdd47466c4dc51f',1,'BM3D_STEP1(Global Namespace)']]], + ['bm3d_5fstep2_551',['BM3D_STEP2',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gga2fc5a9661c1338a823fb3290673a880da8bba899283ff32425773b96c8b577ed2',1,'cv::xphoto::BM3D_STEP2'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gga2fc5a9661c1338a823fb3290673a880da8bba899283ff32425773b96c8b577ed2',1,'BM3D_STEP2(Global Namespace)']]], + ['bm3d_5fstepall_552',['BM3D_STEPALL',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gga2fc5a9661c1338a823fb3290673a880da328ff1593300c0e4f7a2c5b7959528de',1,'cv::xphoto::BM3D_STEPALL'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gga2fc5a9661c1338a823fb3290673a880da328ff1593300c0e4f7a2c5b7959528de',1,'BM3D_STEPALL(Global Namespace)']]], + ['bm3ddenoising_553',['bm3dDenoising',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gadf4af6c1e77be6a1e243067b1291e1f6',1,'cv::xphoto::bm3dDenoising(InputArray src, InputOutputArray dstStep1, OutputArray dstStep2, float h=1, int templateWindowSize=4, int searchWindowSize=16, int blockMatchingStep1=2500, int blockMatchingStep2=400, int groupSize=8, int slidingStep=1, float beta=2.0f, int normType=cv::NORM_L2, int step=cv::xphoto::BM3D_STEPALL, int transformType=cv::xphoto::HAAR)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga467eecdf3ba4fc7abd0d2f3590ceee15',1,'cv::xphoto::bm3dDenoising(InputArray src, OutputArray dst, float h=1, int templateWindowSize=4, int searchWindowSize=16, int blockMatchingStep1=2500, int blockMatchingStep2=400, int groupSize=8, int slidingStep=1, float beta=2.0f, int normType=cv::NORM_L2, int step=cv::xphoto::BM3D_STEPALL, int transformType=cv::xphoto::HAAR)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gadf4af6c1e77be6a1e243067b1291e1f6',1,'bm3dDenoising(InputArray src, InputOutputArray dstStep1, OutputArray dstStep2, float h=1, int templateWindowSize=4, int searchWindowSize=16, int blockMatchingStep1=2500, int blockMatchingStep2=400, int groupSize=8, int slidingStep=1, float beta=2.0f, int normType=cv::NORM_L2, int step=cv::xphoto::BM3D_STEPALL, int transformType=cv::xphoto::HAAR)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga467eecdf3ba4fc7abd0d2f3590ceee15',1,'bm3dDenoising(InputArray src, OutputArray dst, float h=1, int templateWindowSize=4, int searchWindowSize=16, int blockMatchingStep1=2500, int blockMatchingStep2=400, int groupSize=8, int slidingStep=1, float beta=2.0f, int normType=cv::NORM_L2, int step=cv::xphoto::BM3D_STEPALL, int transformType=cv::xphoto::HAAR)(Global Namespace)']]], + ['bm3dsteps_554',['Bm3dSteps',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga2fc5a9661c1338a823fb3290673a880d',1,'cv::xphoto::Bm3dSteps'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga2fc5a9661c1338a823fb3290673a880d',1,'Bm3dSteps(Global Namespace)']]], + ['bndboxes_555',['bndboxes',['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1datasets_1_1PD__inriaObj.html#a9b1f736326cce192d3e9efc7e43c406c',1,'cv::datasets::PD_inriaObj']]], + ['bneedstiltedii_556',['bNeedsTiltedII',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#a7c6683275d2dab4ae553d41f3c8b757e',1,'HaarClassifierCascadeDescriptor']]], + ['bnlllayer_557',['BNLLLayer',['https://docs.opencv.org/4.2.0/d0/d87/classcv_1_1dnn_1_1BNLLLayer.html',1,'cv::dnn']]], + ['board_558',['Board',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1aruco_1_1Board.html',1,'cv::aruco']]], + ['boards_559',['Detection of ArUco Boards',['https://docs.opencv.org/4.2.0/db/da9/tutorial_aruco_board_detection.html',1,'']]], + ['body_560',['body',['https://docs.opencv.org/4.2.0/de/dfb/structcv_1_1cudev_1_1Expr.html#a01cf730d6629c55d44ba1d1e71f1028b',1,'cv::cudev::Expr']]], + ['bool_5fset_561',['bool_set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html',1,'std::tr2::bool_set'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00992.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#a0f07a0992a2bc62b7dbf3f7aa6a01d3d',1,'std::tr2::bool_set::bool_set()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#ab77298d8121ed18a24e80cd0e1d23232',1,'std::tr2::bool_set::bool_set(bool __t)']]], + ['bool_5fset_2etcc_562',['bool_set.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00986.html',1,'']]], + ['boolalpha_563',['boolalpha',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'basic_ios< char, _Traits >::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'basic_iostream< char >::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'basic_istream< char >::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'basic_istream< char, _Traits >::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'basic_ostream< char >::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'basic_ostream< char, _Traits >::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_fstream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_ifstream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_ios::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_iostream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_istream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_istringstream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_ofstream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_ostream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_ostringstream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::basic_stringstream::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7643f003a532a377d00ebe8bd288985f',1,'std::ios_base::boolalpha'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa4c577f2579fd31f7bb2bd4ae582d917',1,'std::boolalpha()']]], ['boolean_564',['BOOLEAN',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aac48d5da12d702e73d6966069f2687376',1,'BOOLEAN(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aac48d5da12d702e73d6966069f2687376',1,'BOOLEAN(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aac48d5da12d702e73d6966069f2687376',1,'BOOLEAN(Global Namespace)']]], - ['boolean_20operations_20classes_565',['Boolean Operations Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01508.html',1,'']]], - ['boolean_5ft_566',['boolean_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a44fd1a12c9c54623c942b430e7a72937.html#a44fd1a12c9c54623c942b430e7a72937',1,'nlohmann::basic_json']]], - ['boost_567',['Boost',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html',1,'cv::ml']]], - ['boost_5fconcept_5fcheck_2eh_568',['boost_concept_check.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00296.html',1,'']]], - ['boostclassifier_569',['boostClassifier',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a0b1b2c774648f93f34f896e21a646125',1,'cv::TrackerStateEstimatorAdaBoosting']]], - ['boostdesc_570',['BoostDesc',['https://docs.opencv.org/4.2.0/d1/dfd/classcv_1_1xfeatures2d_1_1BoostDesc.html',1,'cv::xfeatures2d']]], - ['border_571',['Border',['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html',1,'cv::gapi::fluid::Border'],['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html#a469a515f77aeeead591e9ff4a151c0cc',1,'cv::gapi::fluid::Border::Border(int _type, cv::Scalar _val)'],['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html#afdd79a0637df671b35cae661a4a9678a',1,'cv::gapi::fluid::Border::Border(int _type, cv::gapi::own::Scalar _val)']]], - ['border_5fconstant_572',['BORDER_CONSTANT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5aed2e4346047e265c8c5a6d0276dcd838',1,'cv::BORDER_CONSTANT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5aed2e4346047e265c8c5a6d0276dcd838',1,'BORDER_CONSTANT(Global Namespace)']]], - ['border_5fdefault_573',['BORDER_DEFAULT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5afe14c13a4ea8b8e3b3ef399013dbae01',1,'cv::BORDER_DEFAULT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5afe14c13a4ea8b8e3b3ef399013dbae01',1,'BORDER_DEFAULT(Global Namespace)']]], - ['border_5finterpolate_2ehpp_574',['border_interpolate.hpp',['https://docs.opencv.org/4.2.0/d5/dd1/border__interpolate_8hpp.html',1,'']]], - ['border_5fisolated_575',['BORDER_ISOLATED',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a4fcb77ae62e1e1336c1c2b24a441995c',1,'cv::BORDER_ISOLATED'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a4fcb77ae62e1e1336c1c2b24a441995c',1,'BORDER_ISOLATED(Global Namespace)']]], - ['border_5freflect_576',['BORDER_REFLECT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a815c8a89b7cb206dcba14d11b7560f4b',1,'cv::BORDER_REFLECT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a815c8a89b7cb206dcba14d11b7560f4b',1,'BORDER_REFLECT(Global Namespace)']]], - ['border_5freflect101_577',['BORDER_REFLECT101',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a119fb22eda11675d2e00426d334a1a81',1,'cv::BORDER_REFLECT101'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a119fb22eda11675d2e00426d334a1a81',1,'BORDER_REFLECT101(Global Namespace)']]], - ['border_5freflect_5f101_578',['BORDER_REFLECT_101',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5ab3c5a6143d8120b95005fa7105a10bb4',1,'cv::BORDER_REFLECT_101'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5ab3c5a6143d8120b95005fa7105a10bb4',1,'BORDER_REFLECT_101(Global Namespace)']]], - ['border_5freplicate_579',['BORDER_REPLICATE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5aa1de4cff95e3377d6d0cbe7569bd4e9f',1,'cv::BORDER_REPLICATE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5aa1de4cff95e3377d6d0cbe7569bd4e9f',1,'BORDER_REPLICATE(Global Namespace)']]], - ['border_5ftransparent_580',['BORDER_TRANSPARENT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a886a5eb6b466854d63f9e742d5c8eefe',1,'cv::BORDER_TRANSPARENT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a886a5eb6b466854d63f9e742d5c8eefe',1,'BORDER_TRANSPARENT(Global Namespace)']]], - ['border_5fwrap_581',['BORDER_WRAP',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a697c1b011884a7c2bdc0e5caf7955661',1,'cv::BORDER_WRAP'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a697c1b011884a7c2bdc0e5caf7955661',1,'BORDER_WRAP(Global Namespace)']]], - ['borderinterpolate_582',['borderInterpolate',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga247f571aa6244827d3d798f13892da58',1,'cv::borderInterpolate()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga247f571aa6244827d3d798f13892da58',1,'borderInterpolate()(Global Namespace)']]], - ['bordermode_583',['borderMode',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#a82873b8c79de978db567729308668dac',1,'cv::videostab::MotionInpainter::borderMode()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a84049a042202eaaa59d3822207955dfa',1,'cv::videostab::StabilizerBase::borderMode() const']]], - ['bordermode_5f_584',['borderMode_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aa31e13475d4e01a4e53b83838200a585',1,'cv::videostab::StabilizerBase']]], - ['borderopt_585',['BorderOpt',['https://docs.opencv.org/4.2.0/d0/d1a/namespacecv_1_1gapi_1_1fluid.html#a7a75d671abb94d1acf5f7c6f9690626b',1,'cv::gapi::fluid']]], - ['borders_20to_20your_20images_586',['Adding borders to your images',['https://docs.opencv.org/4.2.0/dc/da3/tutorial_copyMakeBorder.html',1,'']]], - ['bordertypes_587',['BorderTypes',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga209f2f4869e304c82d07739337eae7c5',1,'cv::BorderTypes'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga209f2f4869e304c82d07739337eae7c5',1,'BorderTypes(Global Namespace)']]], - ['borderx_588',['borderX',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga1b12735d5c7b0dc2348af07f0bb1d53e',1,'cv::stereo::PropagationParameters::borderX'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga1b12735d5c7b0dc2348af07f0bb1d53e',1,'borderX(Global Namespace)']]], - ['bordery_589',['borderY',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga6f31e4ba1dc21b23946f55075f443b9b',1,'cv::stereo::PropagationParameters::borderY'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga6f31e4ba1dc21b23946f55075f443b9b',1,'borderY(Global Namespace)']]], - ['both_590',['BOTH',['https://docs.opencv.org/4.2.0/d0/da3/classcv_1_1viz_1_1WTrajectory.html#af448f4e56e68f9d7e1bd1a2c5fce691fa00a9b4c0750fed07e01d54383fb756ed',1,'cv::viz::WTrajectory']]], - ['bothdirections_591',['BothDirections',['https://eigen.tuxfamily.org/dox/group__enums.html#ggad49a7b3738e273eb00932271b36127f7a04fefd61992e941d509a57bc44c59794',1,'Eigen::BothDirections'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggad49a7b3738e273eb00932271b36127f7a04fefd61992e941d509a57bc44c59794',1,'BothDirections(Global Namespace)']]], - ['bottom_5fleft_5forigin_592',['bottom_left_origin',['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#af2f3d6f7e02391eb897be789bd2506fd',1,'cv::gapi::wip::draw::Text']]], - ['bottomleft_593',['BottomLeft',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a384d9fbe2c6b6b69a8ea7c5632a61f5c',1,'Eigen::AlignedBox']]], - ['bottomleftceil_594',['BottomLeftCeil',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a66446e8ccb4fe84bdcebc6d3c1e52a1b',1,'Eigen::AlignedBox']]], - ['bottomleftfloor_595',['BottomLeftFloor',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a66786d5e4ba263c9725c3476fc421281',1,'Eigen::AlignedBox']]], - ['bottomright_596',['bottomRight',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#ab3c3970a65dfa0b4e020e101a9fdae7f',1,'cv::Subdiv2D']]], + ['boolean_565',['boolean',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a82ed080814fa656191a537284bb0c575.html#a82ed080814fa656191a537284bb0c575',1,'nlohmann::json_sax']]], + ['boolean_20operations_20classes_566',['Boolean Operations Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01508.html',1,'']]], + ['boolean_5ft_567',['boolean_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a44fd1a12c9c54623c942b430e7a72937.html#a44fd1a12c9c54623c942b430e7a72937',1,'nlohmann::basic_json']]], + ['boost_568',['Boost',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html',1,'cv::ml']]], + ['boost_5fconcept_5fcheck_2eh_569',['boost_concept_check.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00296.html',1,'']]], + ['boostclassifier_570',['boostClassifier',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a0b1b2c774648f93f34f896e21a646125',1,'cv::TrackerStateEstimatorAdaBoosting']]], + ['boostdesc_571',['BoostDesc',['https://docs.opencv.org/4.2.0/d1/dfd/classcv_1_1xfeatures2d_1_1BoostDesc.html',1,'cv::xfeatures2d']]], + ['border_572',['Border',['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html',1,'cv::gapi::fluid::Border'],['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html#a469a515f77aeeead591e9ff4a151c0cc',1,'cv::gapi::fluid::Border::Border(int _type, cv::Scalar _val)'],['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html#afdd79a0637df671b35cae661a4a9678a',1,'cv::gapi::fluid::Border::Border(int _type, cv::gapi::own::Scalar _val)']]], + ['border_5fconstant_573',['BORDER_CONSTANT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5aed2e4346047e265c8c5a6d0276dcd838',1,'cv::BORDER_CONSTANT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5aed2e4346047e265c8c5a6d0276dcd838',1,'BORDER_CONSTANT(Global Namespace)']]], + ['border_5fdefault_574',['BORDER_DEFAULT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5afe14c13a4ea8b8e3b3ef399013dbae01',1,'cv::BORDER_DEFAULT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5afe14c13a4ea8b8e3b3ef399013dbae01',1,'BORDER_DEFAULT(Global Namespace)']]], + ['border_5finterpolate_2ehpp_575',['border_interpolate.hpp',['https://docs.opencv.org/4.2.0/d5/dd1/border__interpolate_8hpp.html',1,'']]], + ['border_5fisolated_576',['BORDER_ISOLATED',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a4fcb77ae62e1e1336c1c2b24a441995c',1,'cv::BORDER_ISOLATED'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a4fcb77ae62e1e1336c1c2b24a441995c',1,'BORDER_ISOLATED(Global Namespace)']]], + ['border_5freflect_577',['BORDER_REFLECT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a815c8a89b7cb206dcba14d11b7560f4b',1,'cv::BORDER_REFLECT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a815c8a89b7cb206dcba14d11b7560f4b',1,'BORDER_REFLECT(Global Namespace)']]], + ['border_5freflect101_578',['BORDER_REFLECT101',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a119fb22eda11675d2e00426d334a1a81',1,'cv::BORDER_REFLECT101'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a119fb22eda11675d2e00426d334a1a81',1,'BORDER_REFLECT101(Global Namespace)']]], + ['border_5freflect_5f101_579',['BORDER_REFLECT_101',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5ab3c5a6143d8120b95005fa7105a10bb4',1,'cv::BORDER_REFLECT_101'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5ab3c5a6143d8120b95005fa7105a10bb4',1,'BORDER_REFLECT_101(Global Namespace)']]], + ['border_5freplicate_580',['BORDER_REPLICATE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5aa1de4cff95e3377d6d0cbe7569bd4e9f',1,'cv::BORDER_REPLICATE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5aa1de4cff95e3377d6d0cbe7569bd4e9f',1,'BORDER_REPLICATE(Global Namespace)']]], + ['border_5ftransparent_581',['BORDER_TRANSPARENT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a886a5eb6b466854d63f9e742d5c8eefe',1,'cv::BORDER_TRANSPARENT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a886a5eb6b466854d63f9e742d5c8eefe',1,'BORDER_TRANSPARENT(Global Namespace)']]], + ['border_5fwrap_582',['BORDER_WRAP',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a697c1b011884a7c2bdc0e5caf7955661',1,'cv::BORDER_WRAP'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga209f2f4869e304c82d07739337eae7c5a697c1b011884a7c2bdc0e5caf7955661',1,'BORDER_WRAP(Global Namespace)']]], + ['borderinterpolate_583',['borderInterpolate',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga247f571aa6244827d3d798f13892da58',1,'cv::borderInterpolate()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga247f571aa6244827d3d798f13892da58',1,'borderInterpolate()(Global Namespace)']]], + ['bordermode_584',['borderMode',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#a82873b8c79de978db567729308668dac',1,'cv::videostab::MotionInpainter::borderMode()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a84049a042202eaaa59d3822207955dfa',1,'cv::videostab::StabilizerBase::borderMode() const']]], + ['bordermode_5f_585',['borderMode_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aa31e13475d4e01a4e53b83838200a585',1,'cv::videostab::StabilizerBase']]], + ['borderopt_586',['BorderOpt',['https://docs.opencv.org/4.2.0/d0/d1a/namespacecv_1_1gapi_1_1fluid.html#a7a75d671abb94d1acf5f7c6f9690626b',1,'cv::gapi::fluid']]], + ['borders_20to_20your_20images_587',['Adding borders to your images',['https://docs.opencv.org/4.2.0/dc/da3/tutorial_copyMakeBorder.html',1,'']]], + ['bordertypes_588',['BorderTypes',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga209f2f4869e304c82d07739337eae7c5',1,'cv::BorderTypes'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga209f2f4869e304c82d07739337eae7c5',1,'BorderTypes(Global Namespace)']]], + ['borderx_589',['borderX',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga1b12735d5c7b0dc2348af07f0bb1d53e',1,'cv::stereo::PropagationParameters::borderX'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga1b12735d5c7b0dc2348af07f0bb1d53e',1,'borderX(Global Namespace)']]], + ['bordery_590',['borderY',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga6f31e4ba1dc21b23946f55075f443b9b',1,'cv::stereo::PropagationParameters::borderY'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga6f31e4ba1dc21b23946f55075f443b9b',1,'borderY(Global Namespace)']]], + ['both_591',['BOTH',['https://docs.opencv.org/4.2.0/d0/da3/classcv_1_1viz_1_1WTrajectory.html#af448f4e56e68f9d7e1bd1a2c5fce691fa00a9b4c0750fed07e01d54383fb756ed',1,'cv::viz::WTrajectory']]], + ['bothdirections_592',['BothDirections',['https://eigen.tuxfamily.org/dox/group__enums.html#ggad49a7b3738e273eb00932271b36127f7a04fefd61992e941d509a57bc44c59794',1,'Eigen::BothDirections'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggad49a7b3738e273eb00932271b36127f7a04fefd61992e941d509a57bc44c59794',1,'BothDirections(Global Namespace)']]], + ['bottom_5fleft_5forigin_593',['bottom_left_origin',['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#af2f3d6f7e02391eb897be789bd2506fd',1,'cv::gapi::wip::draw::Text']]], + ['bottomleft_594',['BottomLeft',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a384d9fbe2c6b6b69a8ea7c5632a61f5c',1,'Eigen::AlignedBox']]], + ['bottomleftceil_595',['BottomLeftCeil',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a66446e8ccb4fe84bdcebc6d3c1e52a1b',1,'Eigen::AlignedBox']]], + ['bottomleftfloor_596',['BottomLeftFloor',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a66786d5e4ba263c9725c3476fc421281',1,'Eigen::AlignedBox']]], ['bottomright_597',['BottomRight',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a8eba0291472401f9a777cf571f1b8b8b',1,'Eigen::AlignedBox']]], - ['bottomrightceil_598',['BottomRightCeil',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a96ff8acc760b61ae37f38b1f63a21306',1,'Eigen::AlignedBox']]], - ['bottomrightfloor_599',['BottomRightFloor',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a5c7a2e5d12782ebf716aff9c1866f50f',1,'Eigen::AlignedBox']]], - ['bounding_600',['bounding',['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html#afe7012af2bc1cf3542ae212b62951470',1,'cv::datasets::MSM_epflObj']]], - ['bounding_20boxes_20and_20circles_20for_20contours_601',['Creating Bounding boxes and circles for contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'']]], - ['bounding_20rotated_20boxes_20and_20ellipses_20for_20contours_602',['Creating Bounding rotated boxes and ellipses for contours',['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'']]], - ['bounding_5frects_5fcircles_2emarkdown_603',['bounding_rects_circles.markdown',['https://docs.opencv.org/4.2.0/d9/d5b/bounding__rects__circles_8markdown.html',1,'']]], - ['bounding_5frotated_5fellipses_2emarkdown_604',['bounding_rotated_ellipses.markdown',['https://docs.opencv.org/4.2.0/dd/d8b/bounding__rotated__ellipses_8markdown.html',1,'']]], - ['boundingboxes_605',['boundingBoxes',['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html#a1eb381bf160556b85d52cf86be9dac8c',1,'cv::MultiTracker_Alt']]], - ['boundingrect_606',['boundingRect',['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a055a5d35e50bce65e3b1dee318dd3044',1,'cv::RotatedRect::boundingRect()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga103fcbda2f540f3ef1c042d6a9b35ac7',1,'cv::boundingRect()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga103fcbda2f540f3ef1c042d6a9b35ac7',1,'boundingRect()(Global Namespace)']]], - ['boundingrect2f_607',['boundingRect2f',['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a5e2a16189afb56b77218b2d60e094ebe',1,'cv::RotatedRect']]], - ['bowimgdescriptorextractor_608',['BOWImgDescriptorExtractor',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html',1,'cv::BOWImgDescriptorExtractor'],['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#a1fd114a5108edb9d33674d8433ff12ec',1,'cv::BOWImgDescriptorExtractor::BOWImgDescriptorExtractor(const Ptr< DescriptorExtractor > &dextractor, const Ptr< DescriptorMatcher > &dmatcher)'],['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#aa37f98c0c292cfb0e9ec23ef4fbb11c1',1,'cv::BOWImgDescriptorExtractor::BOWImgDescriptorExtractor(const Ptr< DescriptorMatcher > &dmatcher)']]], - ['bowkmeanstrainer_609',['BOWKMeansTrainer',['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html',1,'cv::BOWKMeansTrainer'],['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#a2b6df61c3df97122eb50c417455b5bac',1,'cv::BOWKMeansTrainer::BOWKMeansTrainer()']]], - ['bowtrainer_610',['BOWTrainer',['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html',1,'cv::BOWTrainer'],['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#af02c83dd5e72f5b3b7b78af818b4c80d',1,'cv::BOWTrainer::BOWTrainer()']]], - ['box_611',['Box',['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1ximgproc_1_1Box.html',1,'cv::ximgproc']]], - ['box_20typedefs_612',['Global aligned box typedefs',['https://eigen.tuxfamily.org/dox/group__alignedboxtypedefs.html',1,'']]], - ['boxes_613',['Boxes',['https://docs.opencv.org/4.2.0/d4/d0d/group__ximgproc__edgeboxes.html#ga964c515cc02d84af64086a7d3ab5f2f0',1,'cv::ximgproc::Boxes'],['https://docs.opencv.org/4.2.0/d4/d0d/group__ximgproc__edgeboxes.html#ga964c515cc02d84af64086a7d3ab5f2f0',1,'Boxes(Global Namespace)']]], - ['boxes_20and_20circles_20for_20contours_614',['Creating Bounding boxes and circles for contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'']]], - ['boxes_20and_20ellipses_20for_20contours_615',['Creating Bounding rotated boxes and ellipses for contours',['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'']]], - ['boxfilter_616',['boxFilter',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gad533230ebf2d42509547d514f7d3fbc3',1,'cv::boxFilter()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaa37a58b30753913cbcc7f5425726dbd5',1,'cv::gapi::boxFilter()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gad533230ebf2d42509547d514f7d3fbc3',1,'boxFilter(InputArray src, OutputArray dst, int ddepth, Size ksize, Point anchor=Point(-1,-1), bool normalize=true, int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaa37a58b30753913cbcc7f5425726dbd5',1,'boxFilter(const GMat &src, int dtype, const Size &ksize, const Point &anchor=Point(-1,-1), bool normalize=true, int borderType=BORDER_DEFAULT, const Scalar &borderValue=Scalar(0))(Global Namespace)']]], - ['boxpoints_617',['boxPoints',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf78d467e024b4d7936cf9397185d2f5c',1,'cv::boxPoints()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf78d467e024b4d7936cf9397185d2f5c',1,'boxPoints()(Global Namespace)']]], - ['br_618',['br',['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a722700903985ca4152e98478d0edb64e',1,'cv::Rect_']]], - ['branch_20based_619',['Branch-Based',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01530.html',1,'']]], - ['branch_5fpolicy_620',['branch_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11651.html',1,'__gnu_pbds::detail']]], - ['branch_5fpolicy_2ehpp_621',['branch_policy.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01235.html',1,'']]], - ['branch_5fpolicy_2ftraits_2ehpp_622',['branch_policy/traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17309.html',1,'']]], - ['branch_5fpolicy_3c_20node_5fcitr_2c_20node_5fcitr_2c_20_5falloc_20_3e_623',['branch_policy< Node_CItr, Node_CItr, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11655.html',1,'__gnu_pbds::detail']]], - ['brdbase_624',['BrdBase',['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html',1,'cv::cudev']]], - ['brdconstant_625',['BrdConstant',['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html',1,'cv::cudev']]], - ['brdconstant_626',['brdConstant',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e16c4c648a39416ee9f90ff4258b841',1,'cv::cudev::brdConstant(const SrcPtr &src, typename PtrTraits< SrcPtr >::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b2e0240a61e65a674bb8ce8d4568db3',1,'cv::cudev::brdConstant(const SrcPtr &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e16c4c648a39416ee9f90ff4258b841',1,'brdConstant(const SrcPtr &src, typename PtrTraits< SrcPtr >::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b2e0240a61e65a674bb8ce8d4568db3',1,'brdConstant(const SrcPtr &src)(Global Namespace)']]], - ['brdreflect_627',['BrdReflect',['https://docs.opencv.org/4.2.0/dc/dff/structcv_1_1cudev_1_1BrdReflect.html',1,'cv::cudev']]], - ['brdreflect_628',['brdReflect',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9d881f46d624d225b11b41fac4ed7bf',1,'cv::cudev::brdReflect()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9d881f46d624d225b11b41fac4ed7bf',1,'brdReflect()(Global Namespace)']]], - ['brdreflect101_629',['BrdReflect101',['https://docs.opencv.org/4.2.0/d3/d12/structcv_1_1cudev_1_1BrdReflect101.html',1,'cv::cudev']]], - ['brdreflect101_630',['brdReflect101',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga913f1482e0fd5f9ec84581e55484da32',1,'cv::cudev::brdReflect101()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga913f1482e0fd5f9ec84581e55484da32',1,'brdReflect101()(Global Namespace)']]], - ['brdreplicate_631',['BrdReplicate',['https://docs.opencv.org/4.2.0/d7/de8/structcv_1_1cudev_1_1BrdReplicate.html',1,'cv::cudev']]], - ['brdreplicate_632',['brdReplicate',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9338d863c6ffdfa4bda7adaaee502c48',1,'cv::cudev::brdReplicate()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9338d863c6ffdfa4bda7adaaee502c48',1,'brdReplicate()(Global Namespace)']]], - ['brdwrap_633',['BrdWrap',['https://docs.opencv.org/4.2.0/da/d69/structcv_1_1cudev_1_1BrdWrap.html',1,'cv::cudev']]], - ['brdwrap_634',['brdWrap',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a2460d8d918987120ea22340e19682a',1,'cv::cudev::brdWrap()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a2460d8d918987120ea22340e19682a',1,'brdWrap(const SrcPtr &src)(Global Namespace)']]], - ['brief_635',['ORB (Oriented FAST and Rotated BRIEF)',['https://docs.opencv.org/4.2.0/d1/d89/tutorial_py_orb.html',1,'']]], - ['brief_20binary_20robust_20independent_20elementary_20features_636',['BRIEF (Binary Robust Independent Elementary Features)',['https://docs.opencv.org/4.2.0/dc/d7d/tutorial_py_brief.html',1,'']]], - ['briefdescriptorextractor_637',['BriefDescriptorExtractor',['https://docs.opencv.org/4.2.0/d1/d93/classcv_1_1xfeatures2d_1_1BriefDescriptorExtractor.html',1,'cv::xfeatures2d']]], - ['brightedges_638',['BrightEdges',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a0e6acd5ea62ff95c1e3e071320063f96',1,'cv::ximgproc']]], - ['brightedges_2ehpp_639',['brightedges.hpp',['https://docs.opencv.org/4.2.0/d8/dc5/brightedges_8hpp.html',1,'']]], - ['brightness_20of_20an_20image_640',['Changing the contrast and brightness of an image!',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'']]], - ['brings_20implementations_20of_20different_20image_20hashing_20algorithms_641',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], - ['brisk_642',['BRISK',['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html',1,'cv']]], - ['broadcasting_643',['Reductions, visitors and broadcasting',['https://eigen.tuxfamily.org/dox/group__TutorialReductionsVisitorsBroadcasting.html',1,'']]], - ['broken_5fpromise_644',['broken_promise',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a2c6bc6062e72db1c0915032943cb6452',1,'broken_promise(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a2c6bc6062e72db1c0915032943cb6452',1,'broken_promise(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a2c6bc6062e72db1c0915032943cb6452',1,'broken_promise(Global Namespace)']]], - ['brown_645',['brown',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1e14b67714badd5932f56a8f0e7d67e0',1,'cv::viz::Color']]], - ['browser_646',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], - ['broxopticalflow_647',['BroxOpticalFlow',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html',1,'cv::cuda::BroxOpticalFlow'],['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html',1,'cv::superres::BroxOpticalFlow']]], - ['brush_648',['Mouse as a Paint-Brush',['https://docs.opencv.org/4.2.0/db/d5b/tutorial_py_mouse_handling.html',1,'']]], - ['brute_5fforce_649',['BRUTE_FORCE',['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#ab654e56b6b5b0745022b7ca054ef2c1ca4d97b1f90c4890a8d9bb109943ee3fb1',1,'cv::ml::KNearest']]], - ['bruteforce_650',['BRUTEFORCE',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3baddf99aae344c73b63d77764440711b76',1,'cv::DescriptorMatcher']]], - ['bruteforce_5fhamming_651',['BRUTEFORCE_HAMMING',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3ba7362dae849e477ed4b1bc862c8ebb5c4',1,'cv::DescriptorMatcher']]], - ['bruteforce_5fhamminglut_652',['BRUTEFORCE_HAMMINGLUT',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3bae93477eddb9309e995b78a4eb677b9fe',1,'cv::DescriptorMatcher']]], - ['bruteforce_5fl1_653',['BRUTEFORCE_L1',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3bac4f170ff27df2f2cadabd75c129ec468',1,'cv::DescriptorMatcher']]], - ['bruteforce_5fsl2_654',['BRUTEFORCE_SL2',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3baf88193b09daf077fec5015a9906a67e8',1,'cv::DescriptorMatcher']]], - ['bucket_655',['bucket',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a15955b785b5ba3c61918a1c549fda0d2',1,'__gnu_debug::_Safe_local_iterator']]], - ['bucket_5fcount_656',['bucket_count',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ac8a1a3c1d13adf8908c863a707fa40aa',1,'std::unordered_map::bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a0c57013bd56a6fc373659c4e5807a64d',1,'std::unordered_multimap::bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a151a3546cd927736e1b7741fefd84387',1,'std::unordered_multiset::bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae5b2e99866a8b463ab6f9fe577f08297',1,'std::unordered_set::bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ac8a1a3c1d13adf8908c863a707fa40aa',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::bucket_count()']]], - ['buf_657',['buf',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a5286c7bfa1926f51f6d0c7bf5e01c001',1,'cv::AutoBuffer::buf'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a5286c7bfa1926f51f6d0c7bf5e01c001',1,'AutoBuffer< double, 1 >::buf'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a5286c7bfa1926f51f6d0c7bf5e01c001',1,'AutoBuffer< int64, 1 >::buf'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a5286c7bfa1926f51f6d0c7bf5e01c001',1,'AutoBuffer< String, 1 >::buf'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a264fe8da5b3899ff6040c72d75dda039',1,'cv::MatStep::buf']]], - ['buffer_658',['Buffer',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html',1,'cv::gapi::fluid::Buffer'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html',1,'cv::ogl::Buffer'],['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#afb0e7555d1052072c403e1c9b181bf8e',1,'cv::gapi::fluid::Buffer::Buffer()'],['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#aa60f174e4dd8e6ba5cce3e9293acfddf',1,'cv::gapi::fluid::Buffer::Buffer(const cv::GMatDesc &desc)'],['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a2b08cf4287bbcf09be3ef97eafd56a65',1,'cv::gapi::fluid::Buffer::Buffer(const cv::GMatDesc &desc, int max_line_consumption, int border_size, int skew, int wlpi, BorderOpt border)'],['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a43c53687bee4b01686ab7563d60c756e',1,'cv::gapi::fluid::Buffer::Buffer(const cv::gapi::own::Mat &data, bool is_input)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#af53dfd844f101cc0ba752bf6791890ac',1,'cv::ogl::Buffer::Buffer()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a94a62127a1690d9d2244463c88b0c200',1,'cv::ogl::Buffer::Buffer(int arows, int acols, int atype, unsigned int abufId, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a1598ae7fd0b6f35dee834b8cc6b0e73e',1,'cv::ogl::Buffer::Buffer(Size asize, int atype, unsigned int abufId, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#afb20e60d0a89372f7403c04fcb5444ba',1,'cv::ogl::Buffer::Buffer(int arows, int acols, int atype, Target target=ARRAY_BUFFER, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#af981734a0b35b9bebf48b1edb65291b8',1,'cv::ogl::Buffer::Buffer(Size asize, int atype, Target target=ARRAY_BUFFER, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a7fce522179bc8984c50a3c8b3de3554c',1,'cv::ogl::Buffer::Buffer(InputArray arr, Target target=ARRAY_BUFFER, bool autoRelease=false)']]], - ['bufferpool_659',['BufferPool',['https://docs.opencv.org/4.2.0/d5/d08/classcv_1_1cuda_1_1BufferPool.html',1,'cv::cuda::BufferPool'],['https://docs.opencv.org/4.2.0/d5/d08/classcv_1_1cuda_1_1BufferPool.html#a0f1e0a518847d41663e7344927515761',1,'cv::cuda::BufferPool::BufferPool()'],['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#af5e88420aa936b283addcc8a6233827e',1,'cv::cuda::Stream::BufferPool']]], - ['bufferpool_2ehpp_660',['bufferpool.hpp',['https://docs.opencv.org/4.2.0/df/d28/bufferpool_8hpp.html',1,'']]], - ['bufferpoolcontroller_661',['BufferPoolController',['https://docs.opencv.org/4.2.0/d4/dad/classcv_1_1BufferPoolController.html',1,'cv']]], - ['buffers_3a_20the_20map_20class_662',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], - ['bufid_663',['bufId',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#ade340daf96dbd0649ae55d75d2572b01',1,'cv::ogl::Buffer']]], - ['build_20applications_20with_20opencv_20inside_20the_20microsoft_20visual_20studio_664',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['build_20opencv_20js_665',['Build OpenCV.js',['https://docs.opencv.org/4.2.0/d4/da1/tutorial_js_setup.html',1,'']]], - ['buildcostmatrix_666',['buildCostMatrix',['https://docs.opencv.org/4.2.0/df/d9a/classcv_1_1HistogramCostExtractor.html#a6290833254fedea5058d551c4137b33d',1,'cv::HistogramCostExtractor']]], - ['building_20opencv_20for_20tegra_20with_20cuda_667',['Building OpenCV for Tegra with CUDA',['https://docs.opencv.org/4.2.0/d6/d15/tutorial_building_tegra_cuda.html',1,'']]], - ['building_5ftegra_5fcuda_2emarkdown_668',['building_tegra_cuda.markdown',['https://docs.opencv.org/4.2.0/d7/d04/building__tegra__cuda_8markdown.html',1,'']]], - ['buildmaps_669',['buildMaps',['https://docs.opencv.org/4.2.0/dd/d76/classcv_1_1detail_1_1AffineWarper.html#a489b254ef6deaac009cb07ad27a68ed5',1,'cv::detail::AffineWarper::buildMaps()'],['https://docs.opencv.org/4.2.0/d3/dd6/classcv_1_1detail_1_1CylindricalWarper.html#a08ff8cd30170d95ee92d7710aee09220',1,'cv::detail::CylindricalWarper::buildMaps()'],['https://docs.opencv.org/4.2.0/d9/dbd/classcv_1_1detail_1_1CylindricalWarperGpu.html#a625672bfe4a749decc4f034b25f5eabc',1,'cv::detail::CylindricalWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, OutputArray xmap, OutputArray ymap) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d9/dbd/classcv_1_1detail_1_1CylindricalWarperGpu.html#a6f0622df7bfef1f3c4b13d9712bb2474',1,'cv::detail::CylindricalWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, cuda::GpuMat &xmap, cuda::GpuMat &ymap)'],['https://docs.opencv.org/4.2.0/d3/d3d/classcv_1_1detail_1_1PlaneWarper.html#ae7006a8b4bc50e24348d4fe406fab1c9',1,'cv::detail::PlaneWarper::buildMaps(Size src_size, InputArray K, InputArray R, InputArray T, OutputArray xmap, OutputArray ymap)'],['https://docs.opencv.org/4.2.0/d3/d3d/classcv_1_1detail_1_1PlaneWarper.html#ae661b08d230e82b4dc878b9c828a02c8',1,'cv::detail::PlaneWarper::buildMaps(Size src_size, InputArray K, InputArray R, OutputArray xmap, OutputArray ymap) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d2/d1a/classcv_1_1detail_1_1PlaneWarperGpu.html#a466ee547cea4424d225fc9ae4184e437',1,'cv::detail::PlaneWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, OutputArray xmap, OutputArray ymap) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d2/d1a/classcv_1_1detail_1_1PlaneWarperGpu.html#ab3ad69d82c3fb08e0782722488cfbd9a',1,'cv::detail::PlaneWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, InputArray T, OutputArray xmap, OutputArray ymap) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d2/d1a/classcv_1_1detail_1_1PlaneWarperGpu.html#a734af0ce652d2e2f90bcf93ce5e5d6c2',1,'cv::detail::PlaneWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, cuda::GpuMat &xmap, cuda::GpuMat &ymap)'],['https://docs.opencv.org/4.2.0/d2/d1a/classcv_1_1detail_1_1PlaneWarperGpu.html#aa938412e1747984d9de5023cbf4b32e7',1,'cv::detail::PlaneWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, InputArray T, cuda::GpuMat &xmap, cuda::GpuMat &ymap)'],['https://docs.opencv.org/4.2.0/d5/d76/classcv_1_1PyRotationWarper.html#a1f00fe4be63c3afde6cc62632880ef76',1,'cv::PyRotationWarper::buildMaps()'],['https://docs.opencv.org/4.2.0/da/db8/classcv_1_1detail_1_1RotationWarper.html#ab0ff96c239a3d7d8f11818d19d6f8033',1,'cv::detail::RotationWarper::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'cv::detail::RotationWarperBase::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< CompressedRectilinearPortraitProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< CompressedRectilinearProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< CylindricalPortraitProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< CylindricalProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< FisheyeProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< MercatorProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< PaniniPortraitProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< PaniniProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< PlanePortraitProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< PlaneProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< SphericalPortraitProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< SphericalProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< StereographicProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< TransverseMercatorProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/dd0/classcv_1_1detail_1_1SphericalWarper.html#a837c229215541f760797862985dd8790',1,'cv::detail::SphericalWarper::buildMaps()'],['https://docs.opencv.org/4.2.0/db/d09/classcv_1_1detail_1_1SphericalWarperGpu.html#aceae064b7d60ddc8b93da9a051139ae5',1,'cv::detail::SphericalWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, OutputArray xmap, OutputArray ymap) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/db/d09/classcv_1_1detail_1_1SphericalWarperGpu.html#a72756b62d0ff3befaec32b2166733b39',1,'cv::detail::SphericalWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, cuda::GpuMat &xmap, cuda::GpuMat &ymap)']]], - ['buildopticalflowpyramid_670',['buildOpticalFlowPyramid',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga86640c1c470f87b2660c096d2b22b2ce',1,'cv::buildOpticalFlowPyramid()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga86640c1c470f87b2660c096d2b22b2ce',1,'buildOpticalFlowPyramid()(Global Namespace)']]], - ['buildoptionsaddmatrixdescription_671',['buildOptionsAddMatrixDescription',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga95fc5d853c45a6b1db1d425d831f7d2f',1,'cv::ocl::buildOptionsAddMatrixDescription()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga95fc5d853c45a6b1db1d425d831f7d2f',1,'buildOptionsAddMatrixDescription()(Global Namespace)']]], - ['buildpyramid_672',['buildPyramid',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gacfdda2bc1ac55e96de7e9f0bce7238c0',1,'cv::buildPyramid()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gacfdda2bc1ac55e96de7e9f0bce7238c0',1,'buildPyramid()(Global Namespace)']]], - ['buildwarpaffinemaps_673',['buildWarpAffineMaps',['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga63504590a96e4cc702d994281d17bc1c',1,'cv::cuda::buildWarpAffineMaps()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga63504590a96e4cc702d994281d17bc1c',1,'buildWarpAffineMaps()(Global Namespace)']]], - ['buildwarpperspectivemaps_674',['buildWarpPerspectiveMaps',['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga8d16e3003703bd3b89cca98c913ef864',1,'cv::cuda::buildWarpPerspectiveMaps()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga8d16e3003703bd3b89cca98c913ef864',1,'buildWarpPerspectiveMaps()(Global Namespace)']]], - ['builtwith_675',['builtWith',['https://docs.opencv.org/4.2.0/d9/dee/classcv_1_1cuda_1_1TargetArchs.html#a228153530879a3330507db98984b8eff',1,'cv::cuda::TargetArchs']]], - ['bundleadjuster_676',['bundleAdjuster',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a3afc54727bdd855bad04613f7e337a89',1,'cv::Stitcher::bundleAdjuster()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#aa8938cad4d5b9084c8199ea192f2b332',1,'cv::Stitcher::bundleAdjuster() const']]], - ['bundleadjusteraffine_677',['BundleAdjusterAffine',['https://docs.opencv.org/4.2.0/d6/d8d/classcv_1_1detail_1_1BundleAdjusterAffine.html',1,'cv::detail::BundleAdjusterAffine'],['https://docs.opencv.org/4.2.0/d6/d8d/classcv_1_1detail_1_1BundleAdjusterAffine.html#af31e455560e3322cb509ed78e97eefd7',1,'cv::detail::BundleAdjusterAffine::BundleAdjusterAffine()']]], - ['bundleadjusteraffinepartial_678',['BundleAdjusterAffinePartial',['https://docs.opencv.org/4.2.0/d4/dbb/classcv_1_1detail_1_1BundleAdjusterAffinePartial.html',1,'cv::detail::BundleAdjusterAffinePartial'],['https://docs.opencv.org/4.2.0/d4/dbb/classcv_1_1detail_1_1BundleAdjusterAffinePartial.html#ab85d5c39566456ad3e6bcc44f5ebc9d2',1,'cv::detail::BundleAdjusterAffinePartial::BundleAdjusterAffinePartial()']]], - ['bundleadjusterbase_679',['BundleAdjusterBase',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html',1,'cv::detail::BundleAdjusterBase'],['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a6b2709dce0e39413fa988dc5c0ffc47b',1,'cv::detail::BundleAdjusterBase::BundleAdjusterBase()']]], - ['bundleadjusterray_680',['BundleAdjusterRay',['https://docs.opencv.org/4.2.0/da/d7c/classcv_1_1detail_1_1BundleAdjusterRay.html',1,'cv::detail::BundleAdjusterRay'],['https://docs.opencv.org/4.2.0/da/d7c/classcv_1_1detail_1_1BundleAdjusterRay.html#ac295c09797a8034339e4a76791f6a24f',1,'cv::detail::BundleAdjusterRay::BundleAdjusterRay()']]], - ['bundleadjusterreproj_681',['BundleAdjusterReproj',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1detail_1_1BundleAdjusterReproj.html',1,'cv::detail::BundleAdjusterReproj'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1detail_1_1BundleAdjusterReproj.html#af0dc754d2fa9dec96c9f3a11efe951d1',1,'cv::detail::BundleAdjusterReproj::BundleAdjusterReproj()']]], - ['button_682',['button',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a0674de4c3a2a3aa93b00c61cc474f083',1,'cv::viz::MouseEvent']]], - ['buttoncallback_683',['ButtonCallback',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga17ffcbb2343dc06e56f980b8414e3566',1,'cv::ButtonCallback'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga17ffcbb2343dc06e56f980b8414e3566',1,'ButtonCallback(Global Namespace)']]], - ['by_20a_20gradient_20structure_20tensor_684',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], - ['by_20using_20git_20bash_20version_202_2014_201_20and_20cmake_20version_203_209_201_685',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], - ['by_20using_20morphological_20operations_686',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], - ['by_20value_20to_20functions_687',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], - ['byte_5fcontainer_5fwith_5fsubtype_688',['byte_container_with_subtype',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype.html',1,'nlohmann::byte_container_with_subtype< class >'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a89c78caf8c7b54dc1bcfa4b0b23d2fc8.html#a89c78caf8c7b54dc1bcfa4b0b23d2fc8',1,'nlohmann::byte_container_with_subtype::byte_container_with_subtype() noexcept(noexcept(container_type()))'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a640b6dd55847e86dbb936f97b946170e.html#a640b6dd55847e86dbb936f97b946170e',1,'nlohmann::byte_container_with_subtype::byte_container_with_subtype(const container_type &b) noexcept(noexcept(container_type(b)))'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a9bd3e08ec6d3ed9014ad7d83eca5e3b3.html#a9bd3e08ec6d3ed9014ad7d83eca5e3b3',1,'nlohmann::byte_container_with_subtype::byte_container_with_subtype(const container_type &b, std::uint8_t subtype_) noexcept(noexcept(container_type(b)))'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a73dcae1798eab1b496936bfae7b4b9c0.html#a73dcae1798eab1b496936bfae7b4b9c0',1,'nlohmann::byte_container_with_subtype::byte_container_with_subtype(container_type &&b) noexcept(noexcept(container_type(std::move(b))))'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_aa9e66c61f46afdd9a9c3617967c4c797.html#aa9e66c61f46afdd9a9c3617967c4c797',1,'nlohmann::byte_container_with_subtype::byte_container_with_subtype(container_type &&b, std::uint8_t subtype_) noexcept(noexcept(container_type(std::move(b))))']]], - ['byteslist_689',['bytesList',['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#acd75143ec1fe49467dccc67503a66f07',1,'cv::aruco::Dictionary']]] + ['bottomright_598',['bottomRight',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#ab3c3970a65dfa0b4e020e101a9fdae7f',1,'cv::Subdiv2D']]], + ['bottomrightceil_599',['BottomRightCeil',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a96ff8acc760b61ae37f38b1f63a21306',1,'Eigen::AlignedBox']]], + ['bottomrightfloor_600',['BottomRightFloor',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a5c7a2e5d12782ebf716aff9c1866f50f',1,'Eigen::AlignedBox']]], + ['bounding_601',['bounding',['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html#afe7012af2bc1cf3542ae212b62951470',1,'cv::datasets::MSM_epflObj']]], + ['bounding_20boxes_20and_20circles_20for_20contours_602',['Creating Bounding boxes and circles for contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'']]], + ['bounding_20rotated_20boxes_20and_20ellipses_20for_20contours_603',['Creating Bounding rotated boxes and ellipses for contours',['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'']]], + ['bounding_5frects_5fcircles_2emarkdown_604',['bounding_rects_circles.markdown',['https://docs.opencv.org/4.2.0/d9/d5b/bounding__rects__circles_8markdown.html',1,'']]], + ['bounding_5frotated_5fellipses_2emarkdown_605',['bounding_rotated_ellipses.markdown',['https://docs.opencv.org/4.2.0/dd/d8b/bounding__rotated__ellipses_8markdown.html',1,'']]], + ['boundingboxes_606',['boundingBoxes',['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html#a1eb381bf160556b85d52cf86be9dac8c',1,'cv::MultiTracker_Alt']]], + ['boundingrect_607',['boundingRect',['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a055a5d35e50bce65e3b1dee318dd3044',1,'cv::RotatedRect::boundingRect()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga103fcbda2f540f3ef1c042d6a9b35ac7',1,'cv::boundingRect()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga103fcbda2f540f3ef1c042d6a9b35ac7',1,'boundingRect()(Global Namespace)']]], + ['boundingrect2f_608',['boundingRect2f',['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a5e2a16189afb56b77218b2d60e094ebe',1,'cv::RotatedRect']]], + ['bowimgdescriptorextractor_609',['BOWImgDescriptorExtractor',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html',1,'cv::BOWImgDescriptorExtractor'],['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#a1fd114a5108edb9d33674d8433ff12ec',1,'cv::BOWImgDescriptorExtractor::BOWImgDescriptorExtractor(const Ptr< DescriptorExtractor > &dextractor, const Ptr< DescriptorMatcher > &dmatcher)'],['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#aa37f98c0c292cfb0e9ec23ef4fbb11c1',1,'cv::BOWImgDescriptorExtractor::BOWImgDescriptorExtractor(const Ptr< DescriptorMatcher > &dmatcher)']]], + ['bowkmeanstrainer_610',['BOWKMeansTrainer',['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html',1,'cv::BOWKMeansTrainer'],['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#a2b6df61c3df97122eb50c417455b5bac',1,'cv::BOWKMeansTrainer::BOWKMeansTrainer()']]], + ['bowtrainer_611',['BOWTrainer',['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html',1,'cv::BOWTrainer'],['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#af02c83dd5e72f5b3b7b78af818b4c80d',1,'cv::BOWTrainer::BOWTrainer()']]], + ['box_612',['Box',['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1ximgproc_1_1Box.html',1,'cv::ximgproc']]], + ['box_20typedefs_613',['Global aligned box typedefs',['https://eigen.tuxfamily.org/dox/group__alignedboxtypedefs.html',1,'']]], + ['boxes_614',['Boxes',['https://docs.opencv.org/4.2.0/d4/d0d/group__ximgproc__edgeboxes.html#ga964c515cc02d84af64086a7d3ab5f2f0',1,'cv::ximgproc::Boxes'],['https://docs.opencv.org/4.2.0/d4/d0d/group__ximgproc__edgeboxes.html#ga964c515cc02d84af64086a7d3ab5f2f0',1,'Boxes(Global Namespace)']]], + ['boxes_20and_20circles_20for_20contours_615',['Creating Bounding boxes and circles for contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'']]], + ['boxes_20and_20ellipses_20for_20contours_616',['Creating Bounding rotated boxes and ellipses for contours',['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'']]], + ['boxfilter_617',['boxFilter',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gad533230ebf2d42509547d514f7d3fbc3',1,'cv::boxFilter()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaa37a58b30753913cbcc7f5425726dbd5',1,'cv::gapi::boxFilter()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gad533230ebf2d42509547d514f7d3fbc3',1,'boxFilter(InputArray src, OutputArray dst, int ddepth, Size ksize, Point anchor=Point(-1,-1), bool normalize=true, int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaa37a58b30753913cbcc7f5425726dbd5',1,'boxFilter(const GMat &src, int dtype, const Size &ksize, const Point &anchor=Point(-1,-1), bool normalize=true, int borderType=BORDER_DEFAULT, const Scalar &borderValue=Scalar(0))(Global Namespace)']]], + ['boxpoints_618',['boxPoints',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf78d467e024b4d7936cf9397185d2f5c',1,'cv::boxPoints()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf78d467e024b4d7936cf9397185d2f5c',1,'boxPoints()(Global Namespace)']]], + ['br_619',['br',['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a722700903985ca4152e98478d0edb64e',1,'cv::Rect_']]], + ['branch_20based_620',['Branch-Based',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01530.html',1,'']]], + ['branch_5fpolicy_621',['branch_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11651.html',1,'__gnu_pbds::detail']]], + ['branch_5fpolicy_2ehpp_622',['branch_policy.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01235.html',1,'']]], + ['branch_5fpolicy_2ftraits_2ehpp_623',['branch_policy/traits.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17309.html',1,'']]], + ['branch_5fpolicy_3c_20node_5fcitr_2c_20node_5fcitr_2c_20_5falloc_20_3e_624',['branch_policy< Node_CItr, Node_CItr, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11655.html',1,'__gnu_pbds::detail']]], + ['brdbase_625',['BrdBase',['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html',1,'cv::cudev']]], + ['brdconstant_626',['BrdConstant',['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html',1,'cv::cudev']]], + ['brdconstant_627',['brdConstant',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e16c4c648a39416ee9f90ff4258b841',1,'cv::cudev::brdConstant(const SrcPtr &src, typename PtrTraits< SrcPtr >::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b2e0240a61e65a674bb8ce8d4568db3',1,'cv::cudev::brdConstant(const SrcPtr &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e16c4c648a39416ee9f90ff4258b841',1,'brdConstant(const SrcPtr &src, typename PtrTraits< SrcPtr >::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b2e0240a61e65a674bb8ce8d4568db3',1,'brdConstant(const SrcPtr &src)(Global Namespace)']]], + ['brdreflect_628',['BrdReflect',['https://docs.opencv.org/4.2.0/dc/dff/structcv_1_1cudev_1_1BrdReflect.html',1,'cv::cudev']]], + ['brdreflect_629',['brdReflect',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9d881f46d624d225b11b41fac4ed7bf',1,'cv::cudev::brdReflect()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9d881f46d624d225b11b41fac4ed7bf',1,'brdReflect()(Global Namespace)']]], + ['brdreflect101_630',['BrdReflect101',['https://docs.opencv.org/4.2.0/d3/d12/structcv_1_1cudev_1_1BrdReflect101.html',1,'cv::cudev']]], + ['brdreflect101_631',['brdReflect101',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga913f1482e0fd5f9ec84581e55484da32',1,'cv::cudev::brdReflect101()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga913f1482e0fd5f9ec84581e55484da32',1,'brdReflect101()(Global Namespace)']]], + ['brdreplicate_632',['BrdReplicate',['https://docs.opencv.org/4.2.0/d7/de8/structcv_1_1cudev_1_1BrdReplicate.html',1,'cv::cudev']]], + ['brdreplicate_633',['brdReplicate',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9338d863c6ffdfa4bda7adaaee502c48',1,'cv::cudev::brdReplicate()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9338d863c6ffdfa4bda7adaaee502c48',1,'brdReplicate()(Global Namespace)']]], + ['brdwrap_634',['BrdWrap',['https://docs.opencv.org/4.2.0/da/d69/structcv_1_1cudev_1_1BrdWrap.html',1,'cv::cudev']]], + ['brdwrap_635',['brdWrap',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a2460d8d918987120ea22340e19682a',1,'cv::cudev::brdWrap()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a2460d8d918987120ea22340e19682a',1,'brdWrap(const SrcPtr &src)(Global Namespace)']]], + ['brief_636',['ORB (Oriented FAST and Rotated BRIEF)',['https://docs.opencv.org/4.2.0/d1/d89/tutorial_py_orb.html',1,'']]], + ['brief_20binary_20robust_20independent_20elementary_20features_637',['BRIEF (Binary Robust Independent Elementary Features)',['https://docs.opencv.org/4.2.0/dc/d7d/tutorial_py_brief.html',1,'']]], + ['briefdescriptorextractor_638',['BriefDescriptorExtractor',['https://docs.opencv.org/4.2.0/d1/d93/classcv_1_1xfeatures2d_1_1BriefDescriptorExtractor.html',1,'cv::xfeatures2d']]], + ['brightedges_639',['BrightEdges',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a0e6acd5ea62ff95c1e3e071320063f96',1,'cv::ximgproc']]], + ['brightedges_2ehpp_640',['brightedges.hpp',['https://docs.opencv.org/4.2.0/d8/dc5/brightedges_8hpp.html',1,'']]], + ['brightness_20of_20an_20image_641',['Changing the contrast and brightness of an image!',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'']]], + ['brings_20implementations_20of_20different_20image_20hashing_20algorithms_642',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], + ['brisk_643',['BRISK',['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html',1,'cv']]], + ['broadcasting_644',['Reductions, visitors and broadcasting',['https://eigen.tuxfamily.org/dox/group__TutorialReductionsVisitorsBroadcasting.html',1,'']]], + ['broken_5fpromise_645',['broken_promise',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a2c6bc6062e72db1c0915032943cb6452',1,'broken_promise(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a2c6bc6062e72db1c0915032943cb6452',1,'broken_promise(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a2c6bc6062e72db1c0915032943cb6452',1,'broken_promise(Global Namespace)']]], + ['brown_646',['brown',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1e14b67714badd5932f56a8f0e7d67e0',1,'cv::viz::Color']]], + ['browser_647',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], + ['broxopticalflow_648',['BroxOpticalFlow',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html',1,'cv::cuda::BroxOpticalFlow'],['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html',1,'cv::superres::BroxOpticalFlow']]], + ['brush_649',['Mouse as a Paint-Brush',['https://docs.opencv.org/4.2.0/db/d5b/tutorial_py_mouse_handling.html',1,'']]], + ['brute_5fforce_650',['BRUTE_FORCE',['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#ab654e56b6b5b0745022b7ca054ef2c1ca4d97b1f90c4890a8d9bb109943ee3fb1',1,'cv::ml::KNearest']]], + ['bruteforce_651',['BRUTEFORCE',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3baddf99aae344c73b63d77764440711b76',1,'cv::DescriptorMatcher']]], + ['bruteforce_5fhamming_652',['BRUTEFORCE_HAMMING',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3ba7362dae849e477ed4b1bc862c8ebb5c4',1,'cv::DescriptorMatcher']]], + ['bruteforce_5fhamminglut_653',['BRUTEFORCE_HAMMINGLUT',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3bae93477eddb9309e995b78a4eb677b9fe',1,'cv::DescriptorMatcher']]], + ['bruteforce_5fl1_654',['BRUTEFORCE_L1',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3bac4f170ff27df2f2cadabd75c129ec468',1,'cv::DescriptorMatcher']]], + ['bruteforce_5fsl2_655',['BRUTEFORCE_SL2',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3baf88193b09daf077fec5015a9906a67e8',1,'cv::DescriptorMatcher']]], + ['bucket_656',['bucket',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a15955b785b5ba3c61918a1c549fda0d2',1,'__gnu_debug::_Safe_local_iterator']]], + ['bucket_5fcount_657',['bucket_count',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ac8a1a3c1d13adf8908c863a707fa40aa',1,'std::unordered_map::bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a0c57013bd56a6fc373659c4e5807a64d',1,'std::unordered_multimap::bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a151a3546cd927736e1b7741fefd84387',1,'std::unordered_multiset::bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae5b2e99866a8b463ab6f9fe577f08297',1,'std::unordered_set::bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ac8a1a3c1d13adf8908c863a707fa40aa',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::bucket_count()']]], + ['buf_658',['buf',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a5286c7bfa1926f51f6d0c7bf5e01c001',1,'cv::AutoBuffer::buf'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a5286c7bfa1926f51f6d0c7bf5e01c001',1,'AutoBuffer< double, 1 >::buf'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a5286c7bfa1926f51f6d0c7bf5e01c001',1,'AutoBuffer< int64, 1 >::buf'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a5286c7bfa1926f51f6d0c7bf5e01c001',1,'AutoBuffer< String, 1 >::buf'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a264fe8da5b3899ff6040c72d75dda039',1,'cv::MatStep::buf']]], + ['buffer_659',['Buffer',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html',1,'cv::gapi::fluid::Buffer'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html',1,'cv::ogl::Buffer'],['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#afb0e7555d1052072c403e1c9b181bf8e',1,'cv::gapi::fluid::Buffer::Buffer()'],['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#aa60f174e4dd8e6ba5cce3e9293acfddf',1,'cv::gapi::fluid::Buffer::Buffer(const cv::GMatDesc &desc)'],['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a2b08cf4287bbcf09be3ef97eafd56a65',1,'cv::gapi::fluid::Buffer::Buffer(const cv::GMatDesc &desc, int max_line_consumption, int border_size, int skew, int wlpi, BorderOpt border)'],['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a43c53687bee4b01686ab7563d60c756e',1,'cv::gapi::fluid::Buffer::Buffer(const cv::gapi::own::Mat &data, bool is_input)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#af53dfd844f101cc0ba752bf6791890ac',1,'cv::ogl::Buffer::Buffer()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a94a62127a1690d9d2244463c88b0c200',1,'cv::ogl::Buffer::Buffer(int arows, int acols, int atype, unsigned int abufId, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a1598ae7fd0b6f35dee834b8cc6b0e73e',1,'cv::ogl::Buffer::Buffer(Size asize, int atype, unsigned int abufId, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#afb20e60d0a89372f7403c04fcb5444ba',1,'cv::ogl::Buffer::Buffer(int arows, int acols, int atype, Target target=ARRAY_BUFFER, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#af981734a0b35b9bebf48b1edb65291b8',1,'cv::ogl::Buffer::Buffer(Size asize, int atype, Target target=ARRAY_BUFFER, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a7fce522179bc8984c50a3c8b3de3554c',1,'cv::ogl::Buffer::Buffer(InputArray arr, Target target=ARRAY_BUFFER, bool autoRelease=false)']]], + ['bufferpool_660',['BufferPool',['https://docs.opencv.org/4.2.0/d5/d08/classcv_1_1cuda_1_1BufferPool.html',1,'cv::cuda::BufferPool'],['https://docs.opencv.org/4.2.0/d5/d08/classcv_1_1cuda_1_1BufferPool.html#a0f1e0a518847d41663e7344927515761',1,'cv::cuda::BufferPool::BufferPool()'],['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#af5e88420aa936b283addcc8a6233827e',1,'cv::cuda::Stream::BufferPool']]], + ['bufferpool_2ehpp_661',['bufferpool.hpp',['https://docs.opencv.org/4.2.0/df/d28/bufferpool_8hpp.html',1,'']]], + ['bufferpoolcontroller_662',['BufferPoolController',['https://docs.opencv.org/4.2.0/d4/dad/classcv_1_1BufferPoolController.html',1,'cv']]], + ['buffers_3a_20the_20map_20class_663',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], + ['bufid_664',['bufId',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#ade340daf96dbd0649ae55d75d2572b01',1,'cv::ogl::Buffer']]], + ['build_20applications_20with_20opencv_20inside_20the_20microsoft_20visual_20studio_665',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['build_20opencv_20js_666',['Build OpenCV.js',['https://docs.opencv.org/4.2.0/d4/da1/tutorial_js_setup.html',1,'']]], + ['buildcostmatrix_667',['buildCostMatrix',['https://docs.opencv.org/4.2.0/df/d9a/classcv_1_1HistogramCostExtractor.html#a6290833254fedea5058d551c4137b33d',1,'cv::HistogramCostExtractor']]], + ['building_20opencv_20for_20tegra_20with_20cuda_668',['Building OpenCV for Tegra with CUDA',['https://docs.opencv.org/4.2.0/d6/d15/tutorial_building_tegra_cuda.html',1,'']]], + ['building_5ftegra_5fcuda_2emarkdown_669',['building_tegra_cuda.markdown',['https://docs.opencv.org/4.2.0/d7/d04/building__tegra__cuda_8markdown.html',1,'']]], + ['buildmaps_670',['buildMaps',['https://docs.opencv.org/4.2.0/dd/d76/classcv_1_1detail_1_1AffineWarper.html#a489b254ef6deaac009cb07ad27a68ed5',1,'cv::detail::AffineWarper::buildMaps()'],['https://docs.opencv.org/4.2.0/d3/dd6/classcv_1_1detail_1_1CylindricalWarper.html#a08ff8cd30170d95ee92d7710aee09220',1,'cv::detail::CylindricalWarper::buildMaps()'],['https://docs.opencv.org/4.2.0/d9/dbd/classcv_1_1detail_1_1CylindricalWarperGpu.html#a625672bfe4a749decc4f034b25f5eabc',1,'cv::detail::CylindricalWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, OutputArray xmap, OutputArray ymap) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d9/dbd/classcv_1_1detail_1_1CylindricalWarperGpu.html#a6f0622df7bfef1f3c4b13d9712bb2474',1,'cv::detail::CylindricalWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, cuda::GpuMat &xmap, cuda::GpuMat &ymap)'],['https://docs.opencv.org/4.2.0/d3/d3d/classcv_1_1detail_1_1PlaneWarper.html#ae7006a8b4bc50e24348d4fe406fab1c9',1,'cv::detail::PlaneWarper::buildMaps(Size src_size, InputArray K, InputArray R, InputArray T, OutputArray xmap, OutputArray ymap)'],['https://docs.opencv.org/4.2.0/d3/d3d/classcv_1_1detail_1_1PlaneWarper.html#ae661b08d230e82b4dc878b9c828a02c8',1,'cv::detail::PlaneWarper::buildMaps(Size src_size, InputArray K, InputArray R, OutputArray xmap, OutputArray ymap) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d2/d1a/classcv_1_1detail_1_1PlaneWarperGpu.html#a466ee547cea4424d225fc9ae4184e437',1,'cv::detail::PlaneWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, OutputArray xmap, OutputArray ymap) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d2/d1a/classcv_1_1detail_1_1PlaneWarperGpu.html#ab3ad69d82c3fb08e0782722488cfbd9a',1,'cv::detail::PlaneWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, InputArray T, OutputArray xmap, OutputArray ymap) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d2/d1a/classcv_1_1detail_1_1PlaneWarperGpu.html#a734af0ce652d2e2f90bcf93ce5e5d6c2',1,'cv::detail::PlaneWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, cuda::GpuMat &xmap, cuda::GpuMat &ymap)'],['https://docs.opencv.org/4.2.0/d2/d1a/classcv_1_1detail_1_1PlaneWarperGpu.html#aa938412e1747984d9de5023cbf4b32e7',1,'cv::detail::PlaneWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, InputArray T, cuda::GpuMat &xmap, cuda::GpuMat &ymap)'],['https://docs.opencv.org/4.2.0/d5/d76/classcv_1_1PyRotationWarper.html#a1f00fe4be63c3afde6cc62632880ef76',1,'cv::PyRotationWarper::buildMaps()'],['https://docs.opencv.org/4.2.0/da/db8/classcv_1_1detail_1_1RotationWarper.html#ab0ff96c239a3d7d8f11818d19d6f8033',1,'cv::detail::RotationWarper::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'cv::detail::RotationWarperBase::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< CompressedRectilinearPortraitProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< CompressedRectilinearProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< CylindricalPortraitProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< CylindricalProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< FisheyeProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< MercatorProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< PaniniPortraitProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< PaniniProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< PlanePortraitProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< PlaneProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< SphericalPortraitProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< SphericalProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< StereographicProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4eb9f68904a76e91c51f0b3267e6cd40',1,'RotationWarperBase< TransverseMercatorProjector >::buildMaps()'],['https://docs.opencv.org/4.2.0/d6/dd0/classcv_1_1detail_1_1SphericalWarper.html#a837c229215541f760797862985dd8790',1,'cv::detail::SphericalWarper::buildMaps()'],['https://docs.opencv.org/4.2.0/db/d09/classcv_1_1detail_1_1SphericalWarperGpu.html#aceae064b7d60ddc8b93da9a051139ae5',1,'cv::detail::SphericalWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, OutputArray xmap, OutputArray ymap) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/db/d09/classcv_1_1detail_1_1SphericalWarperGpu.html#a72756b62d0ff3befaec32b2166733b39',1,'cv::detail::SphericalWarperGpu::buildMaps(Size src_size, InputArray K, InputArray R, cuda::GpuMat &xmap, cuda::GpuMat &ymap)']]], + ['buildopticalflowpyramid_671',['buildOpticalFlowPyramid',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga86640c1c470f87b2660c096d2b22b2ce',1,'cv::buildOpticalFlowPyramid()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga86640c1c470f87b2660c096d2b22b2ce',1,'buildOpticalFlowPyramid()(Global Namespace)']]], + ['buildoptionsaddmatrixdescription_672',['buildOptionsAddMatrixDescription',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga95fc5d853c45a6b1db1d425d831f7d2f',1,'cv::ocl::buildOptionsAddMatrixDescription()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga95fc5d853c45a6b1db1d425d831f7d2f',1,'buildOptionsAddMatrixDescription()(Global Namespace)']]], + ['buildpyramid_673',['buildPyramid',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gacfdda2bc1ac55e96de7e9f0bce7238c0',1,'cv::buildPyramid()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gacfdda2bc1ac55e96de7e9f0bce7238c0',1,'buildPyramid()(Global Namespace)']]], + ['buildwarpaffinemaps_674',['buildWarpAffineMaps',['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga63504590a96e4cc702d994281d17bc1c',1,'cv::cuda::buildWarpAffineMaps()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga63504590a96e4cc702d994281d17bc1c',1,'buildWarpAffineMaps()(Global Namespace)']]], + ['buildwarpperspectivemaps_675',['buildWarpPerspectiveMaps',['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga8d16e3003703bd3b89cca98c913ef864',1,'cv::cuda::buildWarpPerspectiveMaps()'],['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html#ga8d16e3003703bd3b89cca98c913ef864',1,'buildWarpPerspectiveMaps()(Global Namespace)']]], + ['builtwith_676',['builtWith',['https://docs.opencv.org/4.2.0/d9/dee/classcv_1_1cuda_1_1TargetArchs.html#a228153530879a3330507db98984b8eff',1,'cv::cuda::TargetArchs']]], + ['bundleadjuster_677',['bundleAdjuster',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a3afc54727bdd855bad04613f7e337a89',1,'cv::Stitcher::bundleAdjuster()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#aa8938cad4d5b9084c8199ea192f2b332',1,'cv::Stitcher::bundleAdjuster() const']]], + ['bundleadjusteraffine_678',['BundleAdjusterAffine',['https://docs.opencv.org/4.2.0/d6/d8d/classcv_1_1detail_1_1BundleAdjusterAffine.html',1,'cv::detail::BundleAdjusterAffine'],['https://docs.opencv.org/4.2.0/d6/d8d/classcv_1_1detail_1_1BundleAdjusterAffine.html#af31e455560e3322cb509ed78e97eefd7',1,'cv::detail::BundleAdjusterAffine::BundleAdjusterAffine()']]], + ['bundleadjusteraffinepartial_679',['BundleAdjusterAffinePartial',['https://docs.opencv.org/4.2.0/d4/dbb/classcv_1_1detail_1_1BundleAdjusterAffinePartial.html',1,'cv::detail::BundleAdjusterAffinePartial'],['https://docs.opencv.org/4.2.0/d4/dbb/classcv_1_1detail_1_1BundleAdjusterAffinePartial.html#ab85d5c39566456ad3e6bcc44f5ebc9d2',1,'cv::detail::BundleAdjusterAffinePartial::BundleAdjusterAffinePartial()']]], + ['bundleadjusterbase_680',['BundleAdjusterBase',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html',1,'cv::detail::BundleAdjusterBase'],['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a6b2709dce0e39413fa988dc5c0ffc47b',1,'cv::detail::BundleAdjusterBase::BundleAdjusterBase()']]], + ['bundleadjusterray_681',['BundleAdjusterRay',['https://docs.opencv.org/4.2.0/da/d7c/classcv_1_1detail_1_1BundleAdjusterRay.html',1,'cv::detail::BundleAdjusterRay'],['https://docs.opencv.org/4.2.0/da/d7c/classcv_1_1detail_1_1BundleAdjusterRay.html#ac295c09797a8034339e4a76791f6a24f',1,'cv::detail::BundleAdjusterRay::BundleAdjusterRay()']]], + ['bundleadjusterreproj_682',['BundleAdjusterReproj',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1detail_1_1BundleAdjusterReproj.html',1,'cv::detail::BundleAdjusterReproj'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1detail_1_1BundleAdjusterReproj.html#af0dc754d2fa9dec96c9f3a11efe951d1',1,'cv::detail::BundleAdjusterReproj::BundleAdjusterReproj()']]], + ['button_683',['button',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a0674de4c3a2a3aa93b00c61cc474f083',1,'cv::viz::MouseEvent']]], + ['buttoncallback_684',['ButtonCallback',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga17ffcbb2343dc06e56f980b8414e3566',1,'cv::ButtonCallback'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga17ffcbb2343dc06e56f980b8414e3566',1,'ButtonCallback(Global Namespace)']]], + ['by_20a_20gradient_20structure_20tensor_685',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], + ['by_20using_20git_20bash_20version_202_2014_201_20and_20cmake_20version_203_209_201_686',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['by_20using_20morphological_20operations_687',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], + ['by_20value_20to_20functions_688',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], + ['byte_5fcontainer_5fwith_5fsubtype_689',['byte_container_with_subtype',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype.html',1,'nlohmann::byte_container_with_subtype< class >'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a89c78caf8c7b54dc1bcfa4b0b23d2fc8.html#a89c78caf8c7b54dc1bcfa4b0b23d2fc8',1,'nlohmann::byte_container_with_subtype::byte_container_with_subtype() noexcept(noexcept(container_type()))'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a640b6dd55847e86dbb936f97b946170e.html#a640b6dd55847e86dbb936f97b946170e',1,'nlohmann::byte_container_with_subtype::byte_container_with_subtype(const container_type &b) noexcept(noexcept(container_type(b)))'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a9bd3e08ec6d3ed9014ad7d83eca5e3b3.html#a9bd3e08ec6d3ed9014ad7d83eca5e3b3',1,'nlohmann::byte_container_with_subtype::byte_container_with_subtype(const container_type &b, std::uint8_t subtype_) noexcept(noexcept(container_type(b)))'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a73dcae1798eab1b496936bfae7b4b9c0.html#a73dcae1798eab1b496936bfae7b4b9c0',1,'nlohmann::byte_container_with_subtype::byte_container_with_subtype(container_type &&b) noexcept(noexcept(container_type(std::move(b))))'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_aa9e66c61f46afdd9a9c3617967c4c797.html#aa9e66c61f46afdd9a9c3617967c4c797',1,'nlohmann::byte_container_with_subtype::byte_container_with_subtype(container_type &&b, std::uint8_t subtype_) noexcept(noexcept(container_type(std::move(b))))']]], + ['byteslist_690',['bytesList',['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#acd75143ec1fe49467dccc67503a66f07',1,'cv::aruco::Dictionary']]] ]; diff --git a/search/all_c.js b/search/all_c.js index 7a55ebea..56d27b5f 100644 --- a/search/all_c.js +++ b/search/all_c.js @@ -1,55 +1,55 @@ var searchData= [ - ['c_0',['c',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5f728e830807710bf3cc18b428057d8e',1,'cv::MatExpr::c'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#a34ee1a0022d3d297d42aca9302d34fbb',1,'cv::ml::DTrees::Split::c'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#a33f73620226c2827824851c0c935b28b',1,'std::queue::c']]], - ['c_1',['C',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3a8eafc49ef685613b37e1b96351fd2bd1',1,'cv::ml::SVM::C'],['https://docs.opencv.org/4.2.0/d8/dd7/group__core__c__glue.html',1,'Connections with C++'],['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'The template and typename keywords in C++']]], + ['c_0',['C',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3a8eafc49ef685613b37e1b96351fd2bd1',1,'cv::ml::SVM::C'],['https://docs.opencv.org/4.2.0/d8/dd7/group__core__c__glue.html',1,'Connections with C++'],['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'The template and typename keywords in C++']]], + ['c_1',['c',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5f728e830807710bf3cc18b428057d8e',1,'cv::MatExpr::c'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#a34ee1a0022d3d297d42aca9302d34fbb',1,'cv::ml::DTrees::Split::c'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#a33f73620226c2827824851c0c935b28b',1,'std::queue::c']]], ['c_20api_2',['C API',['https://docs.opencv.org/4.2.0/df/d4e/group__imgproc__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/da/d0a/group__imgcodecs__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d0/d28/group__highgui__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d3/d12/group__video__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d5/db8/group__calib3d__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d9/d31/group__objdetect__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d3/d40/group__photo__c.html',1,'C API']]], ['c_20api_20for_20video_20i_20o_3',['C API for video I/O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__c.html',1,'']]], ['c_20c_20converters_4',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], - ['c_20structures_20and_20operations_5',['C structures and operations',['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'']]], - ['c_2b_2b0x_5fwarning_2eh_6',['c++0x_warning.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00299.html',1,'']]], - ['c_2b_2ballocator_2eh_7',['c++allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00659.html',1,'']]], - ['c_2b_2bconfig_2eh_8',['c++config.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00662.html',1,'']]], - ['c_2b_2bio_2eh_9',['c++io.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00665.html',1,'']]], - ['c_2b_2blocale_2eh_10',['c++locale.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00668.html',1,'']]], - ['c_2b_2blocale_5finternal_2eh_11',['c++locale_internal.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00671.html',1,'']]], - ['c_5fstr_12',['c_str',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a74426cc065679e05d5b3f279d1440fe3',1,'__gnu_cxx::__versa_string::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< _CharT >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< _CharT, _Traits, _Allocator >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< char >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< char, char_traits< char >, _Byte_alloc >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< char_type, _Traits, _Alloc >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< value_type >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'std::basic_string::c_str()']]], - ['c_5fsvc_13',['C_SVC',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa18157ccaec6a252b901cff6de285d608',1,'cv::ml::SVM']]], - ['cache_14',['Cache',['https://docs.opencv.org/4.2.0/dc/dd8/structcv_1_1gapi_1_1fluid_1_1Buffer_1_1Cache.html',1,'cv::gapi::fluid::Buffer::Cache'],['https://docs.opencv.org/4.2.0/da/da5/structcv_1_1gapi_1_1fluid_1_1View_1_1Cache.html',1,'cv::gapi::fluid::View::Cache']]], - ['cache_5fall_15',['CACHE_ALL',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a5505fd9ba3f77942517cc1a8ed0fe61dac4a54f32647e1d176076e9b1a4d81e82',1,'cv::rgbd::OdometryFrame']]], - ['cache_5fdst_16',['CACHE_DST',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a5505fd9ba3f77942517cc1a8ed0fe61dabd1daa42f6fef759a4be3a20de86c291',1,'cv::rgbd::OdometryFrame']]], - ['cache_5fline_5fsize_17',['cache_line_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a2918b2f3f97a4fbbcfe990e73ace805b',1,'__gnu_parallel::_Settings']]], - ['cache_5fsrc_18',['CACHE_SRC',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a5505fd9ba3f77942517cc1a8ed0fe61daf2acaf8c7230b28821acfd7f2e3b905f',1,'cv::rgbd::OdometryFrame']]], - ['caffe_20framework_20models_19',['Load Caffe framework models',['https://docs.opencv.org/4.2.0/d5/de7/tutorial_dnn_googlenet.html',1,'']]], - ['calc_20',['calc',['https://docs.opencv.org/4.2.0/df/dde/classcv_1_1DenseOpticalFlow.html#a20037021dec04e9006149204ad610d04',1,'cv::DenseOpticalFlow::calc()'],['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1cuda_1_1DenseOpticalFlow.html#a2cf6b216dccee0060c2ff0e4ba090f1c',1,'cv::cuda::DenseOpticalFlow::calc()'],['https://docs.opencv.org/4.2.0/d1/d21/classcv_1_1superres_1_1DenseOpticalFlowExt.html#afdfc49f056e120b56050480cacf5803b',1,'cv::superres::DenseOpticalFlowExt::calc()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga3d6748c4e3c739e5a38f6659740a31e6',1,'cv::CvHOGEvaluator::Feature::calc()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#gabdf0eba294846f69173976639c20b0b7',1,'cv::CvLBPEvaluator::Feature::calc()'],['https://docs.opencv.org/4.2.0/da/d62/classcv_1_1MinProblemSolver_1_1Function.html#a49bb106fb6fb43eadc607486d4d4122f',1,'cv::MinProblemSolver::Function::calc()'],['https://docs.opencv.org/4.2.0/d7/db8/classcv_1_1ml_1_1SVM_1_1Kernel.html#ae5549ba1bcd381d2e4cab115d96442a8',1,'cv::ml::SVM::Kernel::calc()'],['https://docs.opencv.org/4.2.0/d5/d26/classcv_1_1cuda_1_1NvidiaHWOpticalFlow.html#a9c065a6ed6ed6d9a5531f191ac7a366d',1,'cv::cuda::NvidiaHWOpticalFlow::calc()'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#a51022615e6193b464acd99b28a83d770',1,'cv::optflow::OpticalFlowPCAFlow::calc()'],['https://docs.opencv.org/4.2.0/de/d14/classcv_1_1SparseOpticalFlow.html#a1ac8e7fa41838ab3fffa87bad958f5ab',1,'cv::SparseOpticalFlow::calc()'],['https://docs.opencv.org/4.2.0/d5/dcf/classcv_1_1cuda_1_1SparseOpticalFlow.html#a80d5efbb7788e3dc4c49e6226ba34347',1,'cv::cuda::SparseOpticalFlow::calc()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga3d6748c4e3c739e5a38f6659740a31e6',1,'calc(const std::vector< Mat > &_hists, const Mat &_normSum, size_t y, int featComponent) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#gabdf0eba294846f69173976639c20b0b7',1,'calc(const Mat &_sum, size_t y) const(Global Namespace)']]], - ['calcabssum_21',['calcAbsSum',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga15c403b76ab2c4d7ed0f5edc09891b7e',1,'cv::cuda::calcAbsSum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga15c403b76ab2c4d7ed0f5edc09891b7e',1,'calcAbsSum()(Global Namespace)']]], - ['calcbackproject_22',['calcBackProject',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga3a0af640716b456c3d14af8aee12e3ca',1,'cv::calcBackProject(const Mat *images, int nimages, const int *channels, InputArray hist, OutputArray backProject, const float **ranges, double scale=1, bool uniform=true)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga4a9f37b04e5c37fa3a8825774af6dfac',1,'cv::calcBackProject(const Mat *images, int nimages, const int *channels, const SparseMat &hist, OutputArray backProject, const float **ranges, double scale=1, bool uniform=true)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gab644bc90e7475cc047aa1b25dbcbd8df',1,'cv::calcBackProject(InputArrayOfArrays images, const std::vector< int > &channels, InputArray hist, OutputArray dst, const std::vector< float > &ranges, double scale)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga3a0af640716b456c3d14af8aee12e3ca',1,'calcBackProject(const Mat *images, int nimages, const int *channels, InputArray hist, OutputArray backProject, const float **ranges, double scale=1, bool uniform=true)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga4a9f37b04e5c37fa3a8825774af6dfac',1,'calcBackProject(const Mat *images, int nimages, const int *channels, const SparseMat &hist, OutputArray backProject, const float **ranges, double scale=1, bool uniform=true)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gab644bc90e7475cc047aa1b25dbcbd8df',1,'calcBackProject(InputArrayOfArrays images, const std::vector< int > &channels, InputArray hist, OutputArray dst, const std::vector< float > &ranges, double scale)(Global Namespace)']]], - ['calcblurriness_23',['calcBlurriness',['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga527fd10de0ee99ed7585d4a7dc23c470',1,'cv::videostab::calcBlurriness()'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga527fd10de0ee99ed7585d4a7dc23c470',1,'calcBlurriness()(Global Namespace)']]], - ['calccovarmatrix_24',['calcCovarMatrix',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gae6ffa9354633f984246945d52823165d',1,'cv::calcCovarMatrix(const Mat *samples, int nsamples, Mat &covar, Mat &mean, int flags, int ctype=CV_64F)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga017122d912af19d7d0d2cccc2d63819f',1,'cv::calcCovarMatrix(InputArray samples, OutputArray covar, InputOutputArray mean, int flags, int ctype=CV_64F)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gae6ffa9354633f984246945d52823165d',1,'calcCovarMatrix(const Mat *samples, int nsamples, Mat &covar, Mat &mean, int flags, int ctype=CV_64F)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga017122d912af19d7d0d2cccc2d63819f',1,'calcCovarMatrix(InputArray samples, OutputArray covar, InputOutputArray mean, int flags, int ctype=CV_64F)(Global Namespace)']]], - ['calcerror_25',['calcError',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a915c63bff1eb2097710d0cf95f2b9784',1,'cv::detail::BundleAdjusterBase::calcError()'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#aa6a71b1ee5b7fa0b07b55e77106cda13',1,'cv::ml::StatModel::calcError()']]], - ['calcflowmask_26',['calcFlowMask',['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga682d54675bbbffe349241bd6887892b1',1,'cv::videostab::calcFlowMask()'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga682d54675bbbffe349241bd6887892b1',1,'calcFlowMask()(Global Namespace)']]], - ['calcglobalorientation_27',['calcGlobalOrientation',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga9b841df1ad43ae7ea06fb3cdd6408db7',1,'cv::motempl::calcGlobalOrientation()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga9b841df1ad43ae7ea06fb3cdd6408db7',1,'calcGlobalOrientation()(Global Namespace)']]], - ['calchist_28',['calcHist',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga4b2b5fd75503ff9e6844cc4dcdaed35d',1,'cv::calcHist(const Mat *images, int nimages, const int *channels, InputArray mask, OutputArray hist, int dims, const int *histSize, const float **ranges, bool uniform=true, bool accumulate=false)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gada9d547662b7f832dd7b93d378b1137d',1,'cv::calcHist(const Mat *images, int nimages, const int *channels, InputArray mask, SparseMat &hist, int dims, const int *histSize, const float **ranges, bool uniform=true, bool accumulate=false)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga6ca1876785483836f72a77ced8ea759a',1,'cv::calcHist(InputArrayOfArrays images, const std::vector< int > &channels, InputArray mask, OutputArray hist, const std::vector< int > &histSize, const std::vector< float > &ranges, bool accumulate=false)'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#gaaf3944106890947020bb4522a7619c26',1,'cv::cuda::calcHist(InputArray src, OutputArray hist, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga2d55b444ce776c8bbd3087cc90c47f32',1,'cv::cuda::calcHist(InputArray src, InputArray mask, OutputArray hist, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga4b2b5fd75503ff9e6844cc4dcdaed35d',1,'calcHist(const Mat *images, int nimages, const int *channels, InputArray mask, OutputArray hist, int dims, const int *histSize, const float **ranges, bool uniform=true, bool accumulate=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gada9d547662b7f832dd7b93d378b1137d',1,'calcHist(const Mat *images, int nimages, const int *channels, InputArray mask, SparseMat &hist, int dims, const int *histSize, const float **ranges, bool uniform=true, bool accumulate=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga6ca1876785483836f72a77ced8ea759a',1,'calcHist(InputArrayOfArrays images, const std::vector< int > &channels, InputArray mask, OutputArray hist, const std::vector< int > &histSize, const std::vector< float > &ranges, bool accumulate=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#gaaf3944106890947020bb4522a7619c26',1,'calcHist(InputArray src, OutputArray hist, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga2d55b444ce776c8bbd3087cc90c47f32',1,'calcHist(InputArray src, InputArray mask, OutputArray hist, Stream &stream=Stream::Null())(Global Namespace)']]], - ['calcjacobian_29',['calcJacobian',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a2d09d69ec01cd5f4967ed861230f9c45',1,'cv::detail::BundleAdjusterBase']]], - ['calclocalsvdvalues_30',['calcLocalSVDValues',['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1bgsegm_1_1BackgroundSubtractorLSBPDesc.html#a593f16d4712db680b99a04935d2017c4',1,'cv::bgsegm::BackgroundSubtractorLSBPDesc']]], - ['calcmotiongradient_31',['calcMotionGradient',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gaf81cb3d2e60299558df0e4d6c0e059a7',1,'cv::motempl::calcMotionGradient()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gaf81cb3d2e60299558df0e4d6c0e059a7',1,'calcMotionGradient()(Global Namespace)']]], - ['calcnorm_32',['calcNorm',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga39d2826990d29b7e4b69dbe02bdae2e1',1,'cv::cuda::calcNorm()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga39d2826990d29b7e4b69dbe02bdae2e1',1,'calcNorm()(Global Namespace)']]], - ['calcnormdiff_33',['calcNormDiff',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga9be3d9a7b6c5760955f37d1039d01265',1,'cv::cuda::calcNormDiff()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga9be3d9a7b6c5760955f37d1039d01265',1,'calcNormDiff()(Global Namespace)']]], - ['calcnormfactor_34',['calcNormFactor',['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga440e5228dbbe9f9beb1fc00b0e84bfbf',1,'cv::calcNormFactor()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga440e5228dbbe9f9beb1fc00b0e84bfbf',1,'calcNormFactor()(Global Namespace)']]], - ['calcopticalflowbm_35',['calcOpticalFlowBM',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga6b4b2e196ebed9c3a4b6c6330e6e4306',1,'cv::cuda::calcOpticalFlowBM()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga6b4b2e196ebed9c3a4b6c6330e6e4306',1,'calcOpticalFlowBM()(Global Namespace)']]], - ['calcopticalflowdenserlof_36',['calcOpticalFlowDenseRLOF',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga0fc536362c239654322d9015f6efcecd',1,'cv::optflow::calcOpticalFlowDenseRLOF()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga0fc536362c239654322d9015f6efcecd',1,'calcOpticalFlowDenseRLOF()(Global Namespace)']]], - ['calcopticalflowfarneback_37',['calcOpticalFlowFarneback',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga5d10ebbd59fe09c5f650289ec0ece5af',1,'cv::calcOpticalFlowFarneback()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga5d10ebbd59fe09c5f650289ec0ece5af',1,'calcOpticalFlowFarneback()(Global Namespace)']]], - ['calcopticalflowpyrlk_38',['calcOpticalFlowPyrLK',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga473e4b886d0bcc6b65831eb88ed93323',1,'cv::calcOpticalFlowPyrLK()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga473e4b886d0bcc6b65831eb88ed93323',1,'calcOpticalFlowPyrLK()(Global Namespace)']]], - ['calcopticalflowsf_39',['calcOpticalFlowSF',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga370e4f91055a5ae14a0db71850b2f788',1,'cv::optflow::calcOpticalFlowSF(InputArray from, InputArray to, OutputArray flow, int layers, int averaging_block_size, int max_flow)'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gaf23c367519903ed2384e9532e43c7032',1,'cv::optflow::calcOpticalFlowSF(InputArray from, InputArray to, OutputArray flow, int layers, int averaging_block_size, int max_flow, double sigma_dist, double sigma_color, int postprocess_window, double sigma_dist_fix, double sigma_color_fix, double occ_thr, int upscale_averaging_radius, double upscale_sigma_dist, double upscale_sigma_color, double speed_up_thr)'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga370e4f91055a5ae14a0db71850b2f788',1,'calcOpticalFlowSF(InputArray from, InputArray to, OutputArray flow, int layers, int averaging_block_size, int max_flow)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gaf23c367519903ed2384e9532e43c7032',1,'calcOpticalFlowSF(InputArray from, InputArray to, OutputArray flow, int layers, int averaging_block_size, int max_flow, double sigma_dist, double sigma_color, int postprocess_window, double sigma_dist_fix, double sigma_color_fix, double occ_thr, int upscale_averaging_radius, double upscale_sigma_dist, double upscale_sigma_color, double speed_up_thr)(Global Namespace)']]], - ['calcopticalflowsparserlof_40',['calcOpticalFlowSparseRLOF',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga32ba4b0f6a21684d99d45f6bc470f480',1,'cv::optflow::calcOpticalFlowSparseRLOF()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga32ba4b0f6a21684d99d45f6bc470f480',1,'calcOpticalFlowSparseRLOF()(Global Namespace)']]], - ['calcopticalflowsparsetodense_41',['calcOpticalFlowSparseToDense',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gad6aa63f2703202806fe18dc1353b5f4b',1,'cv::optflow::calcOpticalFlowSparseToDense()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gad6aa63f2703202806fe18dc1353b5f4b',1,'calcOpticalFlowSparseToDense()(Global Namespace)']]], - ['calcsqrsum_42',['calcSqrSum',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac998c83597f6c206c78cee16aa87946f',1,'cv::cuda::calcSqrSum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac998c83597f6c206c78cee16aa87946f',1,'calcSqrSum()(Global Namespace)']]], - ['calcsum_43',['calcSum',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga98a09144047f09f5cb1d6b6ea8e0856f',1,'cv::cuda::calcSum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga98a09144047f09f5cb1d6b6ea8e0856f',1,'calcSum()(Global Namespace)']]], - ['calctrackedobjectpositiontoshow_44',['calcTrackedObjectPositionToShow',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a211041e01b46de543af522fc82cdedf9',1,'cv::DetectionBasedTracker::calcTrackedObjectPositionToShow(int i) const'],['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a28f92fe2ee9b297ae6dd9aeac35fc3bd',1,'cv::DetectionBasedTracker::calcTrackedObjectPositionToShow(int i, ObjectStatus &status) const']]], - ['calculate_45',['calculate',['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1reg_1_1Mapper.html#a79e873d67335c52071b0a7be18457e18',1,'cv::reg::Mapper::calculate()'],['https://docs.opencv.org/4.2.0/d0/d89/classcv_1_1reg_1_1MapperGradAffine.html#af3a59a122ae3b88100f6e6a2a89484c7',1,'cv::reg::MapperGradAffine::calculate()'],['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1reg_1_1MapperGradEuclid.html#af2cada1585f908c278b608304e26a853',1,'cv::reg::MapperGradEuclid::calculate()'],['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1reg_1_1MapperGradProj.html#a8106c92e79f9780b5585da17586964eb',1,'cv::reg::MapperGradProj::calculate()'],['https://docs.opencv.org/4.2.0/df/d24/classcv_1_1reg_1_1MapperGradShift.html#a5513f9925e524f5a9373aaac4acdfc66',1,'cv::reg::MapperGradShift::calculate()'],['https://docs.opencv.org/4.2.0/de/d4c/classcv_1_1reg_1_1MapperGradSimilar.html#a643ff83014a05db1ac44d67d274d6ca8',1,'cv::reg::MapperGradSimilar::calculate()'],['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html#a3c6a42d35601a40b1ec575456c5eff00',1,'cv::reg::MapperPyramid::calculate()']]], - ['calculateshift_46',['calculateShift',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a49782cba1b954472ade1d1ff1b8341bb',1,'cv::AlignMTB']]], - ['calculation_47',['calculation',['https://docs.opencv.org/4.2.0/d5/df4/group__core__hal__interface__fastAtan.html',1,'Atan calculation'],['https://docs.opencv.org/4.2.0/d4/d8a/group__core__hal__interface__exp.html',1,'Exponent calculation']]], + ['c_20converters_5',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], + ['c_20structures_20and_20operations_6',['C structures and operations',['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'']]], + ['c_2b_2b0x_5fwarning_2eh_7',['c++0x_warning.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00299.html',1,'']]], + ['c_2b_2ballocator_2eh_8',['c++allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00659.html',1,'']]], + ['c_2b_2bconfig_2eh_9',['c++config.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00662.html',1,'']]], + ['c_2b_2bio_2eh_10',['c++io.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00665.html',1,'']]], + ['c_2b_2blocale_2eh_11',['c++locale.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00668.html',1,'']]], + ['c_2b_2blocale_5finternal_2eh_12',['c++locale_internal.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00671.html',1,'']]], + ['c_5fstr_13',['c_str',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a74426cc065679e05d5b3f279d1440fe3',1,'__gnu_cxx::__versa_string::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< _CharT >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< _CharT, _Traits, _Allocator >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< char >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< char, char_traits< char >, _Byte_alloc >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< char_type, _Traits, _Alloc >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'basic_string< value_type >::c_str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1c644c6d7fe3a686d752a9aecb99da0c',1,'std::basic_string::c_str()']]], + ['c_5fsvc_14',['C_SVC',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa18157ccaec6a252b901cff6de285d608',1,'cv::ml::SVM']]], + ['cache_15',['Cache',['https://docs.opencv.org/4.2.0/dc/dd8/structcv_1_1gapi_1_1fluid_1_1Buffer_1_1Cache.html',1,'cv::gapi::fluid::Buffer::Cache'],['https://docs.opencv.org/4.2.0/da/da5/structcv_1_1gapi_1_1fluid_1_1View_1_1Cache.html',1,'cv::gapi::fluid::View::Cache']]], + ['cache_5fall_16',['CACHE_ALL',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a5505fd9ba3f77942517cc1a8ed0fe61dac4a54f32647e1d176076e9b1a4d81e82',1,'cv::rgbd::OdometryFrame']]], + ['cache_5fdst_17',['CACHE_DST',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a5505fd9ba3f77942517cc1a8ed0fe61dabd1daa42f6fef759a4be3a20de86c291',1,'cv::rgbd::OdometryFrame']]], + ['cache_5fline_5fsize_18',['cache_line_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a2918b2f3f97a4fbbcfe990e73ace805b',1,'__gnu_parallel::_Settings']]], + ['cache_5fsrc_19',['CACHE_SRC',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a5505fd9ba3f77942517cc1a8ed0fe61daf2acaf8c7230b28821acfd7f2e3b905f',1,'cv::rgbd::OdometryFrame']]], + ['caffe_20framework_20models_20',['Load Caffe framework models',['https://docs.opencv.org/4.2.0/d5/de7/tutorial_dnn_googlenet.html',1,'']]], + ['calc_21',['calc',['https://docs.opencv.org/4.2.0/df/dde/classcv_1_1DenseOpticalFlow.html#a20037021dec04e9006149204ad610d04',1,'cv::DenseOpticalFlow::calc()'],['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1cuda_1_1DenseOpticalFlow.html#a2cf6b216dccee0060c2ff0e4ba090f1c',1,'cv::cuda::DenseOpticalFlow::calc()'],['https://docs.opencv.org/4.2.0/d1/d21/classcv_1_1superres_1_1DenseOpticalFlowExt.html#afdfc49f056e120b56050480cacf5803b',1,'cv::superres::DenseOpticalFlowExt::calc()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga3d6748c4e3c739e5a38f6659740a31e6',1,'cv::CvHOGEvaluator::Feature::calc()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#gabdf0eba294846f69173976639c20b0b7',1,'cv::CvLBPEvaluator::Feature::calc()'],['https://docs.opencv.org/4.2.0/da/d62/classcv_1_1MinProblemSolver_1_1Function.html#a49bb106fb6fb43eadc607486d4d4122f',1,'cv::MinProblemSolver::Function::calc()'],['https://docs.opencv.org/4.2.0/d7/db8/classcv_1_1ml_1_1SVM_1_1Kernel.html#ae5549ba1bcd381d2e4cab115d96442a8',1,'cv::ml::SVM::Kernel::calc()'],['https://docs.opencv.org/4.2.0/d5/d26/classcv_1_1cuda_1_1NvidiaHWOpticalFlow.html#a9c065a6ed6ed6d9a5531f191ac7a366d',1,'cv::cuda::NvidiaHWOpticalFlow::calc()'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#a51022615e6193b464acd99b28a83d770',1,'cv::optflow::OpticalFlowPCAFlow::calc()'],['https://docs.opencv.org/4.2.0/de/d14/classcv_1_1SparseOpticalFlow.html#a1ac8e7fa41838ab3fffa87bad958f5ab',1,'cv::SparseOpticalFlow::calc()'],['https://docs.opencv.org/4.2.0/d5/dcf/classcv_1_1cuda_1_1SparseOpticalFlow.html#a80d5efbb7788e3dc4c49e6226ba34347',1,'cv::cuda::SparseOpticalFlow::calc()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga3d6748c4e3c739e5a38f6659740a31e6',1,'calc(const std::vector< Mat > &_hists, const Mat &_normSum, size_t y, int featComponent) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#gabdf0eba294846f69173976639c20b0b7',1,'calc(const Mat &_sum, size_t y) const(Global Namespace)']]], + ['calcabssum_22',['calcAbsSum',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga15c403b76ab2c4d7ed0f5edc09891b7e',1,'cv::cuda::calcAbsSum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga15c403b76ab2c4d7ed0f5edc09891b7e',1,'calcAbsSum()(Global Namespace)']]], + ['calcbackproject_23',['calcBackProject',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga3a0af640716b456c3d14af8aee12e3ca',1,'cv::calcBackProject(const Mat *images, int nimages, const int *channels, InputArray hist, OutputArray backProject, const float **ranges, double scale=1, bool uniform=true)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga4a9f37b04e5c37fa3a8825774af6dfac',1,'cv::calcBackProject(const Mat *images, int nimages, const int *channels, const SparseMat &hist, OutputArray backProject, const float **ranges, double scale=1, bool uniform=true)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gab644bc90e7475cc047aa1b25dbcbd8df',1,'cv::calcBackProject(InputArrayOfArrays images, const std::vector< int > &channels, InputArray hist, OutputArray dst, const std::vector< float > &ranges, double scale)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga3a0af640716b456c3d14af8aee12e3ca',1,'calcBackProject(const Mat *images, int nimages, const int *channels, InputArray hist, OutputArray backProject, const float **ranges, double scale=1, bool uniform=true)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga4a9f37b04e5c37fa3a8825774af6dfac',1,'calcBackProject(const Mat *images, int nimages, const int *channels, const SparseMat &hist, OutputArray backProject, const float **ranges, double scale=1, bool uniform=true)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gab644bc90e7475cc047aa1b25dbcbd8df',1,'calcBackProject(InputArrayOfArrays images, const std::vector< int > &channels, InputArray hist, OutputArray dst, const std::vector< float > &ranges, double scale)(Global Namespace)']]], + ['calcblurriness_24',['calcBlurriness',['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga527fd10de0ee99ed7585d4a7dc23c470',1,'cv::videostab::calcBlurriness()'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga527fd10de0ee99ed7585d4a7dc23c470',1,'calcBlurriness()(Global Namespace)']]], + ['calccovarmatrix_25',['calcCovarMatrix',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gae6ffa9354633f984246945d52823165d',1,'cv::calcCovarMatrix(const Mat *samples, int nsamples, Mat &covar, Mat &mean, int flags, int ctype=CV_64F)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga017122d912af19d7d0d2cccc2d63819f',1,'cv::calcCovarMatrix(InputArray samples, OutputArray covar, InputOutputArray mean, int flags, int ctype=CV_64F)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gae6ffa9354633f984246945d52823165d',1,'calcCovarMatrix(const Mat *samples, int nsamples, Mat &covar, Mat &mean, int flags, int ctype=CV_64F)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga017122d912af19d7d0d2cccc2d63819f',1,'calcCovarMatrix(InputArray samples, OutputArray covar, InputOutputArray mean, int flags, int ctype=CV_64F)(Global Namespace)']]], + ['calcerror_26',['calcError',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a915c63bff1eb2097710d0cf95f2b9784',1,'cv::detail::BundleAdjusterBase::calcError()'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#aa6a71b1ee5b7fa0b07b55e77106cda13',1,'cv::ml::StatModel::calcError()']]], + ['calcflowmask_27',['calcFlowMask',['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga682d54675bbbffe349241bd6887892b1',1,'cv::videostab::calcFlowMask()'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga682d54675bbbffe349241bd6887892b1',1,'calcFlowMask()(Global Namespace)']]], + ['calcglobalorientation_28',['calcGlobalOrientation',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga9b841df1ad43ae7ea06fb3cdd6408db7',1,'cv::motempl::calcGlobalOrientation()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga9b841df1ad43ae7ea06fb3cdd6408db7',1,'calcGlobalOrientation()(Global Namespace)']]], + ['calchist_29',['calcHist',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga4b2b5fd75503ff9e6844cc4dcdaed35d',1,'cv::calcHist(const Mat *images, int nimages, const int *channels, InputArray mask, OutputArray hist, int dims, const int *histSize, const float **ranges, bool uniform=true, bool accumulate=false)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gada9d547662b7f832dd7b93d378b1137d',1,'cv::calcHist(const Mat *images, int nimages, const int *channels, InputArray mask, SparseMat &hist, int dims, const int *histSize, const float **ranges, bool uniform=true, bool accumulate=false)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga6ca1876785483836f72a77ced8ea759a',1,'cv::calcHist(InputArrayOfArrays images, const std::vector< int > &channels, InputArray mask, OutputArray hist, const std::vector< int > &histSize, const std::vector< float > &ranges, bool accumulate=false)'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#gaaf3944106890947020bb4522a7619c26',1,'cv::cuda::calcHist(InputArray src, OutputArray hist, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga2d55b444ce776c8bbd3087cc90c47f32',1,'cv::cuda::calcHist(InputArray src, InputArray mask, OutputArray hist, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga4b2b5fd75503ff9e6844cc4dcdaed35d',1,'calcHist(const Mat *images, int nimages, const int *channels, InputArray mask, OutputArray hist, int dims, const int *histSize, const float **ranges, bool uniform=true, bool accumulate=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gada9d547662b7f832dd7b93d378b1137d',1,'calcHist(const Mat *images, int nimages, const int *channels, InputArray mask, SparseMat &hist, int dims, const int *histSize, const float **ranges, bool uniform=true, bool accumulate=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga6ca1876785483836f72a77ced8ea759a',1,'calcHist(InputArrayOfArrays images, const std::vector< int > &channels, InputArray mask, OutputArray hist, const std::vector< int > &histSize, const std::vector< float > &ranges, bool accumulate=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#gaaf3944106890947020bb4522a7619c26',1,'calcHist(InputArray src, OutputArray hist, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga2d55b444ce776c8bbd3087cc90c47f32',1,'calcHist(InputArray src, InputArray mask, OutputArray hist, Stream &stream=Stream::Null())(Global Namespace)']]], + ['calcjacobian_30',['calcJacobian',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a2d09d69ec01cd5f4967ed861230f9c45',1,'cv::detail::BundleAdjusterBase']]], + ['calclocalsvdvalues_31',['calcLocalSVDValues',['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1bgsegm_1_1BackgroundSubtractorLSBPDesc.html#a593f16d4712db680b99a04935d2017c4',1,'cv::bgsegm::BackgroundSubtractorLSBPDesc']]], + ['calcmotiongradient_32',['calcMotionGradient',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gaf81cb3d2e60299558df0e4d6c0e059a7',1,'cv::motempl::calcMotionGradient()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gaf81cb3d2e60299558df0e4d6c0e059a7',1,'calcMotionGradient()(Global Namespace)']]], + ['calcnorm_33',['calcNorm',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga39d2826990d29b7e4b69dbe02bdae2e1',1,'cv::cuda::calcNorm()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga39d2826990d29b7e4b69dbe02bdae2e1',1,'calcNorm()(Global Namespace)']]], + ['calcnormdiff_34',['calcNormDiff',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga9be3d9a7b6c5760955f37d1039d01265',1,'cv::cuda::calcNormDiff()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga9be3d9a7b6c5760955f37d1039d01265',1,'calcNormDiff()(Global Namespace)']]], + ['calcnormfactor_35',['calcNormFactor',['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga440e5228dbbe9f9beb1fc00b0e84bfbf',1,'cv::calcNormFactor()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga440e5228dbbe9f9beb1fc00b0e84bfbf',1,'calcNormFactor()(Global Namespace)']]], + ['calcopticalflowbm_36',['calcOpticalFlowBM',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga6b4b2e196ebed9c3a4b6c6330e6e4306',1,'cv::cuda::calcOpticalFlowBM()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga6b4b2e196ebed9c3a4b6c6330e6e4306',1,'calcOpticalFlowBM()(Global Namespace)']]], + ['calcopticalflowdenserlof_37',['calcOpticalFlowDenseRLOF',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga0fc536362c239654322d9015f6efcecd',1,'cv::optflow::calcOpticalFlowDenseRLOF()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga0fc536362c239654322d9015f6efcecd',1,'calcOpticalFlowDenseRLOF()(Global Namespace)']]], + ['calcopticalflowfarneback_38',['calcOpticalFlowFarneback',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga5d10ebbd59fe09c5f650289ec0ece5af',1,'cv::calcOpticalFlowFarneback()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga5d10ebbd59fe09c5f650289ec0ece5af',1,'calcOpticalFlowFarneback()(Global Namespace)']]], + ['calcopticalflowpyrlk_39',['calcOpticalFlowPyrLK',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga473e4b886d0bcc6b65831eb88ed93323',1,'cv::calcOpticalFlowPyrLK()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga473e4b886d0bcc6b65831eb88ed93323',1,'calcOpticalFlowPyrLK()(Global Namespace)']]], + ['calcopticalflowsf_40',['calcOpticalFlowSF',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga370e4f91055a5ae14a0db71850b2f788',1,'cv::optflow::calcOpticalFlowSF(InputArray from, InputArray to, OutputArray flow, int layers, int averaging_block_size, int max_flow)'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gaf23c367519903ed2384e9532e43c7032',1,'cv::optflow::calcOpticalFlowSF(InputArray from, InputArray to, OutputArray flow, int layers, int averaging_block_size, int max_flow, double sigma_dist, double sigma_color, int postprocess_window, double sigma_dist_fix, double sigma_color_fix, double occ_thr, int upscale_averaging_radius, double upscale_sigma_dist, double upscale_sigma_color, double speed_up_thr)'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga370e4f91055a5ae14a0db71850b2f788',1,'calcOpticalFlowSF(InputArray from, InputArray to, OutputArray flow, int layers, int averaging_block_size, int max_flow)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gaf23c367519903ed2384e9532e43c7032',1,'calcOpticalFlowSF(InputArray from, InputArray to, OutputArray flow, int layers, int averaging_block_size, int max_flow, double sigma_dist, double sigma_color, int postprocess_window, double sigma_dist_fix, double sigma_color_fix, double occ_thr, int upscale_averaging_radius, double upscale_sigma_dist, double upscale_sigma_color, double speed_up_thr)(Global Namespace)']]], + ['calcopticalflowsparserlof_41',['calcOpticalFlowSparseRLOF',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga32ba4b0f6a21684d99d45f6bc470f480',1,'cv::optflow::calcOpticalFlowSparseRLOF()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga32ba4b0f6a21684d99d45f6bc470f480',1,'calcOpticalFlowSparseRLOF()(Global Namespace)']]], + ['calcopticalflowsparsetodense_42',['calcOpticalFlowSparseToDense',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gad6aa63f2703202806fe18dc1353b5f4b',1,'cv::optflow::calcOpticalFlowSparseToDense()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gad6aa63f2703202806fe18dc1353b5f4b',1,'calcOpticalFlowSparseToDense()(Global Namespace)']]], + ['calcsqrsum_43',['calcSqrSum',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac998c83597f6c206c78cee16aa87946f',1,'cv::cuda::calcSqrSum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac998c83597f6c206c78cee16aa87946f',1,'calcSqrSum()(Global Namespace)']]], + ['calcsum_44',['calcSum',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga98a09144047f09f5cb1d6b6ea8e0856f',1,'cv::cuda::calcSum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga98a09144047f09f5cb1d6b6ea8e0856f',1,'calcSum()(Global Namespace)']]], + ['calctrackedobjectpositiontoshow_45',['calcTrackedObjectPositionToShow',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a211041e01b46de543af522fc82cdedf9',1,'cv::DetectionBasedTracker::calcTrackedObjectPositionToShow(int i) const'],['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a28f92fe2ee9b297ae6dd9aeac35fc3bd',1,'cv::DetectionBasedTracker::calcTrackedObjectPositionToShow(int i, ObjectStatus &status) const']]], + ['calculate_46',['calculate',['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1reg_1_1Mapper.html#a79e873d67335c52071b0a7be18457e18',1,'cv::reg::Mapper::calculate()'],['https://docs.opencv.org/4.2.0/d0/d89/classcv_1_1reg_1_1MapperGradAffine.html#af3a59a122ae3b88100f6e6a2a89484c7',1,'cv::reg::MapperGradAffine::calculate()'],['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1reg_1_1MapperGradEuclid.html#af2cada1585f908c278b608304e26a853',1,'cv::reg::MapperGradEuclid::calculate()'],['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1reg_1_1MapperGradProj.html#a8106c92e79f9780b5585da17586964eb',1,'cv::reg::MapperGradProj::calculate()'],['https://docs.opencv.org/4.2.0/df/d24/classcv_1_1reg_1_1MapperGradShift.html#a5513f9925e524f5a9373aaac4acdfc66',1,'cv::reg::MapperGradShift::calculate()'],['https://docs.opencv.org/4.2.0/de/d4c/classcv_1_1reg_1_1MapperGradSimilar.html#a643ff83014a05db1ac44d67d274d6ca8',1,'cv::reg::MapperGradSimilar::calculate()'],['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html#a3c6a42d35601a40b1ec575456c5eff00',1,'cv::reg::MapperPyramid::calculate()']]], + ['calculateshift_47',['calculateShift',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a49782cba1b954472ade1d1ff1b8341bb',1,'cv::AlignMTB']]], ['calculation_48',['Calculation',['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html',1,'Histogram Calculation'],['https://docs.opencv.org/4.2.0/d8/dbc/tutorial_histogram_calculation.html',1,'Histogram Calculation']]], - ['calculation_49',['calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'Inverse square root calculation'],['https://docs.opencv.org/4.2.0/d7/d99/group__core__hal__interface__magnitude.html',1,'Magnitude calculation'],['https://docs.opencv.org/4.2.0/d2/de4/group__core__hal__interface__log.html',1,'Natural logarithm calculation'],['https://docs.opencv.org/4.2.0/d5/dc3/group__core__hal__interface__sqrt.html',1,'Square root calculation']]], + ['calculation_49',['calculation',['https://docs.opencv.org/4.2.0/d5/df4/group__core__hal__interface__fastAtan.html',1,'Atan calculation'],['https://docs.opencv.org/4.2.0/d4/d8a/group__core__hal__interface__exp.html',1,'Exponent calculation'],['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'Inverse square root calculation'],['https://docs.opencv.org/4.2.0/d7/d99/group__core__hal__interface__magnitude.html',1,'Magnitude calculation'],['https://docs.opencv.org/4.2.0/d2/de4/group__core__hal__interface__log.html',1,'Natural logarithm calculation'],['https://docs.opencv.org/4.2.0/d5/dc3/group__core__hal__interface__sqrt.html',1,'Square root calculation']]], ['calcuv_50',['calcUV',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#ab5b8feedb5e6a91bc1030ac63110cf2b',1,'cv::VariationalRefinement']]], ['calcvoronoi_51',['calcVoronoi',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a08dc6b05f6fae0314aba9c2e197371ce',1,'cv::Subdiv2D']]], ['calib3d_20module_52',['Camera calibration and 3D reconstruction (calib3d module)',['https://docs.opencv.org/4.2.0/d6/d55/tutorial_table_of_content_calib3d.html',1,'']]], @@ -136,2067 +136,2059 @@ var searchData= ['cam_133',['cam',['../namespacecam.html',1,'']]], ['cam_5fparams_5f_134',['cam_params_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a075f23eff9fafb25b01dc0d909ec308c',1,'cv::detail::BundleAdjusterBase']]], ['cameara_20calibration_135',['Omnidirectional Cameara Calibration',['https://docs.opencv.org/4.2.0/dd/d12/tutorial_omnidir_calib_main.html',1,'']]], - ['camera_136',['Camera',['../classcam_1_1Camera.html',1,'cam::Camera'],['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html',1,'cv::viz::Camera']]], + ['camera_136',['Camera',['../classcam_1_1Camera.html',1,'cam::Camera'],['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html',1,'cv::viz::Camera'],['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#ac4afd9495231ef900a3ac44d5dbae1eb',1,'cv::viz::Camera::Camera(double fx, double fy, double cx, double cy, const Size &window_size)'],['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#adfb8260cd7b7690a88034d744f3aaaf7',1,'cv::viz::Camera::Camera(const Vec2d &fov, const Size &window_size)'],['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#a0ad47710fac7456055e3b0fa0483a910',1,'cv::viz::Camera::Camera(const Matx33d &K, const Size &window_size)'],['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#af2a32b2bbdea2f30f5ce00e76af71c0a',1,'cv::viz::Camera::Camera(const Matx44d &proj, const Size &window_size)'],['../classcam_1_1Camera.html#a4d51ed4f26c643eacbaeb06567a2fbbf',1,'cam::Camera::Camera()'],['../classcam_1_1Camera.html#afe066797bd210e03881f30bc862a8ee6',1,'cam::Camera::Camera(std::string filename, std::string name, std::string description="", CameraParams intrinsic_params=CameraParams(), cv::Mat extrinsic_params=cv::Mat())'],['../classcam_1_1Camera.html#a97739884fe994d43d91f207c1fd66567',1,'cam::Camera::Camera(int camera_id, std::string name, std::string description="", CameraParams intrinsic_params=CameraParams(), cv::Mat extrinsic_params=cv::Mat())'],['../classcam_1_1Camera.html#ab6a91c8c2a114bc7cab580b034fbb598',1,'cam::Camera::Camera(const Camera &other)']]], ['camera_137',['camera',['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html#a2d13719083f38130de1db8aeb9384cfa',1,'cv::datasets::MSM_epflObj']]], - ['camera_138',['Camera',['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#ac4afd9495231ef900a3ac44d5dbae1eb',1,'cv::viz::Camera::Camera(double fx, double fy, double cx, double cy, const Size &window_size)'],['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#adfb8260cd7b7690a88034d744f3aaaf7',1,'cv::viz::Camera::Camera(const Vec2d &fov, const Size &window_size)'],['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#a0ad47710fac7456055e3b0fa0483a910',1,'cv::viz::Camera::Camera(const Matx33d &K, const Size &window_size)'],['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#af2a32b2bbdea2f30f5ce00e76af71c0a',1,'cv::viz::Camera::Camera(const Matx44d &proj, const Size &window_size)'],['../classcam_1_1Camera.html#a4d51ed4f26c643eacbaeb06567a2fbbf',1,'cam::Camera::Camera()'],['../classcam_1_1Camera.html#afe066797bd210e03881f30bc862a8ee6',1,'cam::Camera::Camera(std::string filename, std::string name, std::string description="", CameraParams intrinsic_params=CameraParams(), cv::Mat extrinsic_params=cv::Mat())'],['../classcam_1_1Camera.html#a97739884fe994d43d91f207c1fd66567',1,'cam::Camera::Camera(int camera_id, std::string name, std::string description="", CameraParams intrinsic_params=CameraParams(), cv::Mat extrinsic_params=cv::Mat())'],['../classcam_1_1Camera.html#ab6a91c8c2a114bc7cab580b034fbb598',1,'cam::Camera::Camera(const Camera &other)']]], - ['camera_20access_139',['Camera Access',['../group__camera.html',1,'']]], - ['camera_20calibration_140',['Camera Calibration',['https://docs.opencv.org/4.2.0/dc/dbb/tutorial_py_calibration.html',1,'']]], - ['camera_20calibration_141',['Multi-camera Calibration',['https://docs.opencv.org/4.2.0/d2/d1c/tutorial_multi_camera_main.html',1,'']]], - ['camera_20calibration_20and_203d_20reconstruction_142',['Camera Calibration and 3D Reconstruction',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html',1,'Camera Calibration and 3D Reconstruction'],['https://docs.opencv.org/4.2.0/d9/db7/tutorial_py_table_of_contents_calib3d.html',1,'Camera Calibration and 3D Reconstruction']]], - ['camera_20calibration_20and_203d_20reconstruction_20calib3d_20module_143',['Camera calibration and 3D reconstruction (calib3d module)',['https://docs.opencv.org/4.2.0/d6/d55/tutorial_table_of_content_calib3d.html',1,'']]], - ['camera_20calibration_20application_144',['Interactive camera calibration application',['https://docs.opencv.org/4.2.0/d7/d21/tutorial_interactive_calibration.html',1,'']]], - ['camera_20calibration_20with_20opencv_145',['Camera calibration With OpenCV',['https://docs.opencv.org/4.2.0/d4/d94/tutorial_camera_calibration.html',1,'']]], - ['camera_20calibration_20with_20square_20chessboard_146',['Camera calibration with square chessboard',['https://docs.opencv.org/4.2.0/dc/d43/tutorial_camera_calibration_square_chess.html',1,'']]], - ['camera_20configuration_147',['Camera Configuration',['../cameraconfig.html',1,'']]], - ['camera_20model_148',['Fisheye camera model',['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html',1,'']]], - ['camera_20motion_20estimation_149',['Camera Motion Estimation',['https://docs.opencv.org/4.2.0/d5/dab/tutorial_sfm_trajectory_estimation.html',1,'']]], - ['camera_20preview_20based_20cv_20application_150',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], - ['camera_2ehpp_151',['camera.hpp',['https://docs.opencv.org/4.2.0/d0/d8a/camera_8hpp.html',1,'']]], - ['camera_5fcalibration_2emarkdown_152',['camera_calibration.markdown',['https://docs.opencv.org/4.2.0/d8/d78/camera__calibration_8markdown.html',1,'']]], - ['camera_5fcalibration_5fpattern_2emarkdown_153',['camera_calibration_pattern.markdown',['https://docs.opencv.org/4.2.0/df/d05/camera__calibration__pattern_8markdown.html',1,'']]], - ['camera_5fcalibration_5fsquare_5fchess_2emarkdown_154',['camera_calibration_square_chess.markdown',['https://docs.opencv.org/4.2.0/de/d59/camera__calibration__square__chess_8markdown.html',1,'']]], - ['cameraavailable_155',['cameraAvailable',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#acfd8f1830e5588430db00b66b0361323',1,'CvAbstractCamera']]], - ['cameraconfig_156',['CameraConfig',['../structcam_1_1CameraConfig.html',1,'cam']]], - ['cameraframe_157',['CameraFrame',['../namespacerobot_1_1types.html#aca6679b197c5bb4ea8e72ce486d97ab7',1,'robot::types']]], - ['cameraid_158',['CameraID',['../namespacerobot_1_1types.html#a661b446ff0dd408d725e2fdcf8ee4494',1,'robot::types']]], - ['cameramatrix_159',['cameraMatrix',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#adc38bd9a03bb5aa4d83ceb51a4068f39',1,'cv::rgbd::FastICPOdometry::cameraMatrix'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#aac4941bb98f3c73ba40f96363057b9c4',1,'cv::rgbd::ICPOdometry::cameraMatrix'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#ab8634229ebceb18b8472c1f7467dd43a',1,'cv::rgbd::RgbdICPOdometry::cameraMatrix'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a979422d9603d729dd003f6332b2c3a56',1,'cv::rgbd::RgbdOdometry::cameraMatrix']]], - ['cameraparam_160',['cameraParam',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html',1,'cv::datasets']]], - ['cameraparams_161',['CameraParams',['../classcam_1_1CameraParams.html',1,'cam::CameraParams'],['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html',1,'cv::detail::CameraParams'],['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#a1fe82496bda9faaecacd5c7625bc0093',1,'cv::detail::CameraParams::CameraParams()'],['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#a3d90371d2e87a3ac638e3cd9109381c1',1,'cv::detail::CameraParams::CameraParams(const CameraParams &other)'],['../classcam_1_1CameraParams.html#a98ffb2af6ad2b44af39cf0b56bef342b',1,'cam::CameraParams::CameraParams()'],['../classcam_1_1CameraParams.html#ae1e13bc6b8665ddcae22a59a2e349d63',1,'cam::CameraParams::CameraParams(const cv::Mat &camera_matrix, const cv::Mat &dist_coeff, cv::Size image_size=cv::Size(640, 480))'],['../classcam_1_1CameraParams.html#a361c1faad23176886b120da4e9007492',1,'cam::CameraParams::CameraParams(const CameraParams &other)']]], + ['camera_20access_138',['Camera Access',['../group__camera.html',1,'']]], + ['camera_20calibration_139',['Camera Calibration',['https://docs.opencv.org/4.2.0/dc/dbb/tutorial_py_calibration.html',1,'']]], + ['camera_20calibration_140',['Multi-camera Calibration',['https://docs.opencv.org/4.2.0/d2/d1c/tutorial_multi_camera_main.html',1,'']]], + ['camera_20calibration_20and_203d_20reconstruction_141',['Camera Calibration and 3D Reconstruction',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html',1,'Camera Calibration and 3D Reconstruction'],['https://docs.opencv.org/4.2.0/d9/db7/tutorial_py_table_of_contents_calib3d.html',1,'Camera Calibration and 3D Reconstruction']]], + ['camera_20calibration_20and_203d_20reconstruction_20calib3d_20module_142',['Camera calibration and 3D reconstruction (calib3d module)',['https://docs.opencv.org/4.2.0/d6/d55/tutorial_table_of_content_calib3d.html',1,'']]], + ['camera_20calibration_20application_143',['Interactive camera calibration application',['https://docs.opencv.org/4.2.0/d7/d21/tutorial_interactive_calibration.html',1,'']]], + ['camera_20calibration_20with_20opencv_144',['Camera calibration With OpenCV',['https://docs.opencv.org/4.2.0/d4/d94/tutorial_camera_calibration.html',1,'']]], + ['camera_20calibration_20with_20square_20chessboard_145',['Camera calibration with square chessboard',['https://docs.opencv.org/4.2.0/dc/d43/tutorial_camera_calibration_square_chess.html',1,'']]], + ['camera_20configuration_146',['Camera Configuration',['../cameraconfig.html',1,'']]], + ['camera_20model_147',['Fisheye camera model',['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html',1,'']]], + ['camera_20motion_20estimation_148',['Camera Motion Estimation',['https://docs.opencv.org/4.2.0/d5/dab/tutorial_sfm_trajectory_estimation.html',1,'']]], + ['camera_20preview_20based_20cv_20application_149',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], + ['camera_2ehpp_150',['camera.hpp',['https://docs.opencv.org/4.2.0/d0/d8a/camera_8hpp.html',1,'']]], + ['camera_5fcalibration_2emarkdown_151',['camera_calibration.markdown',['https://docs.opencv.org/4.2.0/d8/d78/camera__calibration_8markdown.html',1,'']]], + ['camera_5fcalibration_5fpattern_2emarkdown_152',['camera_calibration_pattern.markdown',['https://docs.opencv.org/4.2.0/df/d05/camera__calibration__pattern_8markdown.html',1,'']]], + ['camera_5fcalibration_5fsquare_5fchess_2emarkdown_153',['camera_calibration_square_chess.markdown',['https://docs.opencv.org/4.2.0/de/d59/camera__calibration__square__chess_8markdown.html',1,'']]], + ['cameraavailable_154',['cameraAvailable',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#acfd8f1830e5588430db00b66b0361323',1,'CvAbstractCamera']]], + ['cameraconfig_155',['CameraConfig',['../structcam_1_1CameraConfig.html',1,'cam']]], + ['cameraframe_156',['CameraFrame',['../namespacerobot_1_1types.html#aca6679b197c5bb4ea8e72ce486d97ab7',1,'robot::types']]], + ['cameraid_157',['CameraID',['../namespacerobot_1_1types.html#a661b446ff0dd408d725e2fdcf8ee4494',1,'robot::types']]], + ['cameramatrix_158',['cameraMatrix',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#adc38bd9a03bb5aa4d83ceb51a4068f39',1,'cv::rgbd::FastICPOdometry::cameraMatrix'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#aac4941bb98f3c73ba40f96363057b9c4',1,'cv::rgbd::ICPOdometry::cameraMatrix'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#ab8634229ebceb18b8472c1f7467dd43a',1,'cv::rgbd::RgbdICPOdometry::cameraMatrix'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a979422d9603d729dd003f6332b2c3a56',1,'cv::rgbd::RgbdOdometry::cameraMatrix']]], + ['cameraparam_159',['cameraParam',['https://docs.opencv.org/4.2.0/d3/d99/structcv_1_1datasets_1_1cameraParam.html',1,'cv::datasets']]], + ['cameraparams_160',['CameraParams',['../classcam_1_1CameraParams.html',1,'cam::CameraParams'],['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html',1,'cv::detail::CameraParams'],['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#a1fe82496bda9faaecacd5c7625bc0093',1,'cv::detail::CameraParams::CameraParams()'],['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#a3d90371d2e87a3ac638e3cd9109381c1',1,'cv::detail::CameraParams::CameraParams(const CameraParams &other)'],['../classcam_1_1CameraParams.html#a98ffb2af6ad2b44af39cf0b56bef342b',1,'cam::CameraParams::CameraParams()'],['../classcam_1_1CameraParams.html#ae1e13bc6b8665ddcae22a59a2e349d63',1,'cam::CameraParams::CameraParams(const cv::Mat &camera_matrix, const cv::Mat &dist_coeff, cv::Size image_size=cv::Size(640, 480))'],['../classcam_1_1CameraParams.html#a361c1faad23176886b120da4e9007492',1,'cam::CameraParams::CameraParams(const CameraParams &other)']]], + ['camerapos_161',['CameraPos',['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html#a387cec4bc5440764ff7d2aacfc473e5a',1,'cv::cnn_3dobj::icoSphere']]], ['camerapos_162',['cameraPos',['https://docs.opencv.org/4.2.0/d1/d64/structcv_1_1datasets_1_1cameraPos.html',1,'cv::datasets']]], - ['camerapos_163',['CameraPos',['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html#a387cec4bc5440764ff7d2aacfc473e5a',1,'cv::cnn_3dobj::icoSphere']]], - ['cameras_164',['cameras',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#af9097e2b658dc1d3d57763c3fefd40aa',1,'cv::Stitcher']]], - ['camerastreamtask_165',['CameraStreamTask',['../classnet_1_1mc_1_1tasks_1_1CameraStreamTask.html',1,'net::mc::tasks']]], - ['cameravertex_166',['cameraVertex',['https://docs.opencv.org/4.2.0/df/db0/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1edge.html#a18e6069280ce9e1ade0ea2357fd81308',1,'cv::multicalib::MultiCameraCalibration::edge']]], - ['camshift_167',['CamShift',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gaef2bd39c8356f423124f1fe7c44d54a1',1,'cv::CamShift()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gaef2bd39c8356f423124f1fe7c44d54a1',1,'CamShift(InputArray probImage, Rect &window, TermCriteria criteria)(Global Namespace)']]], - ['camshift_168',['Camshift',['https://docs.opencv.org/4.2.0/d7/d00/tutorial_meanshift.html',1,'Meanshift and Camshift'],['https://docs.opencv.org/4.2.0/db/df8/tutorial_py_meanshift.html',1,'Meanshift and Camshift'],['https://docs.opencv.org/4.2.0/df/def/tutorial_js_meanshift.html',1,'Meanshift and Camshift']]], - ['can_169',['can',['../namespacecan.html',1,'']]], - ['can_3a_3amotor_170',['motor',['../namespacecan_1_1motor.html',1,'can']]], - ['can_5fdescribe_171',['can_describe',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#acd80cf3f542d39ca2d1b5688e917aad3',1,'cv::can_describe(const GMetaArg &meta, const GRunArg &arg)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#adeef82445e8695e38c9eea17281a62c6',1,'cv::can_describe(const GMetaArgs &metas, const GRunArgs &args)']]], - ['can_5fmotor_172',['can_motor',['../classrobot_1_1can__motor.html',1,'robot::can_motor'],['../classrobot_1_1can__motor.html#ad9516b34a81d5bd06d337b0fc4bcc5e0',1,'robot::can_motor::can_motor()']]], - ['cancel_173',['cancel',['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1gapi_1_1wip_1_1GAsyncContext.html#a90ca03859848638a92ff5ab0780ce810',1,'cv::gapi::wip::GAsyncContext']]], - ['cancreatealias_174',['canCreateAlias',['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#a8c9dd58298eed71239fbf5da38e79480',1,'cv::ocl::Image2D']]], - ['candescribe_175',['canDescribe',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a4eb272351ccdf19f1236fc68bcc8a4be',1,'cv::GMatDesc::canDescribe(const cv::gapi::own::Mat &mat) const'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#af5ff4c580b9c3d2162ae4d6ff9c0537e',1,'cv::GMatDesc::canDescribe(const cv::Mat &mat) const']]], - ['candidate_176',['Candidate',['https://docs.opencv.org/4.2.0/df/da3/structcv_1_1linemod_1_1QuantizedPyramid_1_1Candidate.html',1,'cv::linemod::QuantizedPyramid::Candidate'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaf3cb84fcb9d153e9118ce05ac85a9661',1,'cv::linemod::QuantizedPyramid::Candidate::Candidate()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaf3cb84fcb9d153e9118ce05ac85a9661',1,'Candidate()(Global Namespace)']]], - ['canmaphostmemory_177',['canMapHostMemory',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8345db2ebf373ccdd0704ec9554a5ce5',1,'cv::cuda::DeviceInfo']]], - ['canny_178',['Canny',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga04723e007ed888ddf11d9ba04e2232de',1,'cv::Canny(InputArray image, OutputArray edges, double threshold1, double threshold2, int apertureSize=3, bool L2gradient=false)'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga2a671611e104c093843d7b7fc46d24af',1,'cv::Canny(InputArray dx, InputArray dy, OutputArray edges, double threshold1, double threshold2, bool L2gradient=false)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gad93b9f85e6abecc152d05d3e75bac37a',1,'cv::gapi::Canny()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga04723e007ed888ddf11d9ba04e2232de',1,'Canny(InputArray image, OutputArray edges, double threshold1, double threshold2, int apertureSize=3, bool L2gradient=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga2a671611e104c093843d7b7fc46d24af',1,'Canny(InputArray dx, InputArray dy, OutputArray edges, double threshold1, double threshold2, bool L2gradient=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gad93b9f85e6abecc152d05d3e75bac37a',1,'Canny(const GMat &image, double threshold1, double threshold2, int apertureSize=3, bool L2gradient=false)(Global Namespace)']]], - ['canny_20edge_20detection_179',['Canny Edge Detection',['https://docs.opencv.org/4.2.0/da/d22/tutorial_py_canny.html',1,'Canny Edge Detection'],['https://docs.opencv.org/4.2.0/d7/de1/tutorial_js_canny.html',1,'Canny Edge Detection']]], - ['canny_20edge_20detector_180',['Canny Edge Detector',['https://docs.opencv.org/4.2.0/da/d5c/tutorial_canny_detector.html',1,'']]], - ['canny_5fdetector_2emarkdown_181',['canny_detector.markdown',['https://docs.opencv.org/4.2.0/d0/d6f/canny__detector_8markdown.html',1,'']]], - ['cannyedgedetector_182',['CannyEdgeDetector',['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html',1,'cv::cuda']]], - ['canonical_183',['canonical',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#af060c2cb5335bc792026ed4499d583c5',1,'cv::utils::fs']]], - ['canreshape_184',['canReshape',['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a772dd5e07d0b01894805d920c1f10c24',1,'cv::GCompiled']]], - ['cap_185',['cap',['https://docs.opencv.org/4.2.0/dd/d1c/classcv_1_1gapi_1_1wip_1_1GCaptureSource.html#aa2cb96618d16f46f6a8765d7b7368901',1,'cv::gapi::wip::GCaptureSource::cap'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a8c6d7b52a28206072d540c9567874649',1,'cv::VideoCapture::cap']]], - ['cap_2ehpp_186',['cap.hpp',['https://docs.opencv.org/4.2.0/d8/dd3/cap_8hpp.html',1,'']]], - ['cap_5fandroid_187',['CAP_ANDROID',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da0a3b80ec023425a27431991500d26847',1,'cv::CAP_ANDROID'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da0a3b80ec023425a27431991500d26847',1,'CAP_ANDROID(Global Namespace)']]], - ['cap_5fany_188',['CAP_ANY',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da77ab1fe260fd182f8ec7655fab27a31d',1,'cv::CAP_ANY'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da77ab1fe260fd182f8ec7655fab27a31d',1,'CAP_ANY(Global Namespace)']]], - ['cap_5faravis_189',['CAP_ARAVIS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da154dbbfdbcd9aee0ebcbca984479c57a',1,'cv::CAP_ARAVIS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da154dbbfdbcd9aee0ebcbca984479c57a',1,'CAP_ARAVIS(Global Namespace)']]], - ['cap_5favfoundation_190',['CAP_AVFOUNDATION',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dad40e88621d29a819d17f14207cb12326',1,'cv::CAP_AVFOUNDATION'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dad40e88621d29a819d17f14207cb12326',1,'CAP_AVFOUNDATION(Global Namespace)']]], - ['cap_5fcmu1394_191',['CAP_CMU1394',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da50f0063ddd92eae7eb4c9d5657c57f01',1,'cv::CAP_CMU1394'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da50f0063ddd92eae7eb4c9d5657c57f01',1,'CAP_CMU1394(Global Namespace)']]], - ['cap_5fdc1394_192',['CAP_DC1394',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da90613927859093cb37c9df3acf47061b',1,'cv::CAP_DC1394'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da90613927859093cb37c9df3acf47061b',1,'CAP_DC1394(Global Namespace)']]], - ['cap_5fdshow_193',['CAP_DSHOW',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dab6ac3effa04f41ed5470375c85a23504',1,'cv::CAP_DSHOW'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dab6ac3effa04f41ed5470375c85a23504',1,'CAP_DSHOW(Global Namespace)']]], - ['cap_5fffmpeg_194',['CAP_FFMPEG',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dacf10e9692c4166f74de62b7d00c377d0',1,'cv::CAP_FFMPEG'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dacf10e9692c4166f74de62b7d00c377d0',1,'CAP_FFMPEG(Global Namespace)']]], - ['cap_5ffireware_195',['CAP_FIREWARE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dab51c7fc9cc4dda4f63f9a86dc3212f89',1,'cv::CAP_FIREWARE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dab51c7fc9cc4dda4f63f9a86dc3212f89',1,'CAP_FIREWARE(Global Namespace)']]], - ['cap_5ffirewire_196',['CAP_FIREWIRE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da8555c783cb62cdc666806d3faf8efa09',1,'cv::CAP_FIREWIRE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da8555c783cb62cdc666806d3faf8efa09',1,'CAP_FIREWIRE(Global Namespace)']]], - ['cap_5fgiganetix_197',['CAP_GIGANETIX',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daf4dde3ebf402904bf78b40956035b766',1,'cv::CAP_GIGANETIX'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daf4dde3ebf402904bf78b40956035b766',1,'CAP_GIGANETIX(Global Namespace)']]], - ['cap_5fgphoto2_198',['CAP_GPHOTO2',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da96c457f30fddf85dc689f940a4c07807',1,'cv::CAP_GPHOTO2'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da96c457f30fddf85dc689f940a4c07807',1,'CAP_GPHOTO2(Global Namespace)']]], - ['cap_5fgstreamer_199',['CAP_GSTREAMER',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da38dcac6866f7608675dd35ba0b9c3c07',1,'cv::CAP_GSTREAMER'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da38dcac6866f7608675dd35ba0b9c3c07',1,'CAP_GSTREAMER(Global Namespace)']]], - ['cap_5fieee1394_200',['CAP_IEEE1394',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daf1b3045737ea7a591c26d6050a5a4755',1,'cv::CAP_IEEE1394'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daf1b3045737ea7a591c26d6050a5a4755',1,'CAP_IEEE1394(Global Namespace)']]], - ['cap_5fimages_201',['CAP_IMAGES',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dabe73da7a65e66cdd47c87733a4ea6ef0',1,'cv::CAP_IMAGES'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dabe73da7a65e66cdd47c87733a4ea6ef0',1,'CAP_IMAGES(Global Namespace)']]], - ['cap_5fintel_5fmfx_202',['CAP_INTEL_MFX',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da7212c0c08fcb32247b7cdb62466955f4',1,'cv::CAP_INTEL_MFX'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da7212c0c08fcb32247b7cdb62466955f4',1,'CAP_INTEL_MFX(Global Namespace)']]], - ['cap_5fintelperc_203',['CAP_INTELPERC',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dabe0df46cd132d1cfbae88efd6f4becdf',1,'cv::CAP_INTELPERC'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dabe0df46cd132d1cfbae88efd6f4becdf',1,'CAP_INTELPERC(Global Namespace)']]], - ['cap_5fintelperc_5fdepth_5fgenerator_204',['CAP_INTELPERC_DEPTH_GENERATOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132caf09153f3c7f98ceb038d39453da205cf',1,'cv::CAP_INTELPERC_DEPTH_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132caf09153f3c7f98ceb038d39453da205cf',1,'cv::CAP_INTELPERC_DEPTH_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132caf09153f3c7f98ceb038d39453da205cf',1,'CAP_INTELPERC_DEPTH_GENERATOR(Global Namespace)']]], - ['cap_5fintelperc_5fdepth_5fmap_205',['CAP_INTELPERC_DEPTH_MAP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a0633813010b6c21838951de5fb34d643',1,'cv::CAP_INTELPERC_DEPTH_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a0633813010b6c21838951de5fb34d643',1,'cv::CAP_INTELPERC_DEPTH_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a0633813010b6c21838951de5fb34d643',1,'CAP_INTELPERC_DEPTH_MAP(Global Namespace)']]], - ['cap_5fintelperc_5fgenerators_5fmask_206',['CAP_INTELPERC_GENERATORS_MASK',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132cabae15b45bbfb9ace04d86ff77e438e4e',1,'cv::CAP_INTELPERC_GENERATORS_MASK'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132cabae15b45bbfb9ace04d86ff77e438e4e',1,'cv::CAP_INTELPERC_GENERATORS_MASK'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132cabae15b45bbfb9ace04d86ff77e438e4e',1,'CAP_INTELPERC_GENERATORS_MASK(Global Namespace)']]], - ['cap_5fintelperc_5fimage_207',['CAP_INTELPERC_IMAGE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a5c722445f6d9324474cf50b39b92ae74',1,'cv::CAP_INTELPERC_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a5c722445f6d9324474cf50b39b92ae74',1,'cv::CAP_INTELPERC_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a5c722445f6d9324474cf50b39b92ae74',1,'CAP_INTELPERC_IMAGE(Global Namespace)']]], - ['cap_5fintelperc_5fimage_5fgenerator_208',['CAP_INTELPERC_IMAGE_GENERATOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132ca428daa198f3d2593d78abca6348c125d',1,'cv::CAP_INTELPERC_IMAGE_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132ca428daa198f3d2593d78abca6348c125d',1,'cv::CAP_INTELPERC_IMAGE_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132ca428daa198f3d2593d78abca6348c125d',1,'CAP_INTELPERC_IMAGE_GENERATOR(Global Namespace)']]], - ['cap_5fintelperc_5fir_5fgenerator_209',['CAP_INTELPERC_IR_GENERATOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132caf40091a565b49a9554c42e8a3c006936',1,'cv::CAP_INTELPERC_IR_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132caf40091a565b49a9554c42e8a3c006936',1,'cv::CAP_INTELPERC_IR_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132caf40091a565b49a9554c42e8a3c006936',1,'CAP_INTELPERC_IR_GENERATOR(Global Namespace)']]], - ['cap_5fintelperc_5fir_5fmap_210',['CAP_INTELPERC_IR_MAP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a56fd50220f952776712bcfb656a5c64d',1,'cv::CAP_INTELPERC_IR_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a56fd50220f952776712bcfb656a5c64d',1,'cv::CAP_INTELPERC_IR_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a56fd50220f952776712bcfb656a5c64d',1,'CAP_INTELPERC_IR_MAP(Global Namespace)']]], - ['cap_5fintelperc_5fuvdepth_5fmap_211',['CAP_INTELPERC_UVDEPTH_MAP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9aaafadc6ce2abb8a2e962b2d4115a0f48',1,'cv::CAP_INTELPERC_UVDEPTH_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9aaafadc6ce2abb8a2e962b2d4115a0f48',1,'cv::CAP_INTELPERC_UVDEPTH_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9aaafadc6ce2abb8a2e962b2d4115a0f48',1,'CAP_INTELPERC_UVDEPTH_MAP(Global Namespace)']]], - ['cap_5fios_2eh_212',['cap_ios.h',['https://docs.opencv.org/4.2.0/d9/d4d/cap__ios_8h.html',1,'']]], - ['cap_5fmsmf_213',['CAP_MSMF',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da278d5ad4907c9c0fe6d1c6104b746019',1,'cv::CAP_MSMF'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da278d5ad4907c9c0fe6d1c6104b746019',1,'CAP_MSMF(Global Namespace)']]], - ['cap_5fopencv_5fmjpeg_214',['CAP_OPENCV_MJPEG',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da30dc8f8843e26aa10d401799f62eaa25',1,'cv::CAP_OPENCV_MJPEG'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da30dc8f8843e26aa10d401799f62eaa25',1,'CAP_OPENCV_MJPEG(Global Namespace)']]], - ['cap_5fopenni_215',['CAP_OPENNI',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daa073098573ce0968cb7a79de1a5ce0ee',1,'cv::CAP_OPENNI'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daa073098573ce0968cb7a79de1a5ce0ee',1,'CAP_OPENNI(Global Namespace)']]], - ['cap_5fopenni2_216',['CAP_OPENNI2',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dabfd6ffd761dc1b2841b5595f089412e7',1,'cv::CAP_OPENNI2'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dabfd6ffd761dc1b2841b5595f089412e7',1,'CAP_OPENNI2(Global Namespace)']]], - ['cap_5fopenni2_5fasus_217',['CAP_OPENNI2_ASUS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da2c24b5fa88b2d575c3555f2732899937',1,'cv::CAP_OPENNI2_ASUS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da2c24b5fa88b2d575c3555f2732899937',1,'CAP_OPENNI2_ASUS(Global Namespace)']]], - ['cap_5fopenni_5fasus_218',['CAP_OPENNI_ASUS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da19bf6cb6cd40b856d55867ce1a88f7af',1,'cv::CAP_OPENNI_ASUS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da19bf6cb6cd40b856d55867ce1a88f7af',1,'CAP_OPENNI_ASUS(Global Namespace)']]], - ['cap_5fopenni_5fbgr_5fimage_219',['CAP_OPENNI_BGR_IMAGE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a467bac9001f40dea888f47ac55886c23',1,'cv::CAP_OPENNI_BGR_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a467bac9001f40dea888f47ac55886c23',1,'cv::CAP_OPENNI_BGR_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a467bac9001f40dea888f47ac55886c23',1,'CAP_OPENNI_BGR_IMAGE(Global Namespace)']]], - ['cap_5fopenni_5fdepth_5fgenerator_220',['CAP_OPENNI_DEPTH_GENERATOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a803680384669d80d0294ad7836ec57e6',1,'cv::CAP_OPENNI_DEPTH_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a803680384669d80d0294ad7836ec57e6',1,'cv::CAP_OPENNI_DEPTH_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a803680384669d80d0294ad7836ec57e6',1,'CAP_OPENNI_DEPTH_GENERATOR(Global Namespace)']]], - ['cap_5fopenni_5fdepth_5fgenerator_5fbaseline_221',['CAP_OPENNI_DEPTH_GENERATOR_BASELINE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966afefc8beb33fe05b3729b422678893215',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_BASELINE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966afefc8beb33fe05b3729b422678893215',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_BASELINE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966afefc8beb33fe05b3729b422678893215',1,'CAP_OPENNI_DEPTH_GENERATOR_BASELINE(Global Namespace)']]], - ['cap_5fopenni_5fdepth_5fgenerator_5ffocal_5flength_222',['CAP_OPENNI_DEPTH_GENERATOR_FOCAL_LENGTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a8033186b1063aa190fd91661aac79b5d',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a8033186b1063aa190fd91661aac79b5d',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a8033186b1063aa190fd91661aac79b5d',1,'CAP_OPENNI_DEPTH_GENERATOR_FOCAL_LENGTH(Global Namespace)']]], - ['cap_5fopenni_5fdepth_5fgenerator_5fpresent_223',['CAP_OPENNI_DEPTH_GENERATOR_PRESENT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a35506303a7585ddfaf30ad453704af13',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a35506303a7585ddfaf30ad453704af13',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a35506303a7585ddfaf30ad453704af13',1,'CAP_OPENNI_DEPTH_GENERATOR_PRESENT(Global Namespace)']]], - ['cap_5fopenni_5fdepth_5fgenerator_5fregistration_224',['CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a4bfc7955622984b48420bf8fecda6388',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a4bfc7955622984b48420bf8fecda6388',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a4bfc7955622984b48420bf8fecda6388',1,'CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION(Global Namespace)']]], - ['cap_5fopenni_5fdepth_5fgenerator_5fregistration_5fon_225',['CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION_ON',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a5c1c8b4e40121d8a906d39d772117700',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION_ON'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a5c1c8b4e40121d8a906d39d772117700',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION_ON'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a5c1c8b4e40121d8a906d39d772117700',1,'CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION_ON(Global Namespace)']]], - ['cap_5fopenni_5fdepth_5fmap_226',['CAP_OPENNI_DEPTH_MAP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a2278fe906c8f7508e6e7a92f46888661',1,'cv::CAP_OPENNI_DEPTH_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a2278fe906c8f7508e6e7a92f46888661',1,'cv::CAP_OPENNI_DEPTH_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a2278fe906c8f7508e6e7a92f46888661',1,'CAP_OPENNI_DEPTH_MAP(Global Namespace)']]], - ['cap_5fopenni_5fdisparity_5fmap_227',['CAP_OPENNI_DISPARITY_MAP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a549229ff705c2c4d637712b93041e06f',1,'cv::CAP_OPENNI_DISPARITY_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a549229ff705c2c4d637712b93041e06f',1,'cv::CAP_OPENNI_DISPARITY_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a549229ff705c2c4d637712b93041e06f',1,'CAP_OPENNI_DISPARITY_MAP(Global Namespace)']]], - ['cap_5fopenni_5fdisparity_5fmap_5f32f_228',['CAP_OPENNI_DISPARITY_MAP_32F',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a471838d1ee511e9555d07abe076db5b1',1,'cv::CAP_OPENNI_DISPARITY_MAP_32F'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a471838d1ee511e9555d07abe076db5b1',1,'cv::CAP_OPENNI_DISPARITY_MAP_32F'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a471838d1ee511e9555d07abe076db5b1',1,'CAP_OPENNI_DISPARITY_MAP_32F(Global Namespace)']]], - ['cap_5fopenni_5fgenerators_5fmask_229',['CAP_OPENNI_GENERATORS_MASK',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462aa78452e84ffa2e3544cb0006ed89e842',1,'cv::CAP_OPENNI_GENERATORS_MASK'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462aa78452e84ffa2e3544cb0006ed89e842',1,'cv::CAP_OPENNI_GENERATORS_MASK'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462aa78452e84ffa2e3544cb0006ed89e842',1,'CAP_OPENNI_GENERATORS_MASK(Global Namespace)']]], - ['cap_5fopenni_5fgray_5fimage_230',['CAP_OPENNI_GRAY_IMAGE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75ae9fad51a17faff9b4351ccaa6b8375ba',1,'cv::CAP_OPENNI_GRAY_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75ae9fad51a17faff9b4351ccaa6b8375ba',1,'cv::CAP_OPENNI_GRAY_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75ae9fad51a17faff9b4351ccaa6b8375ba',1,'CAP_OPENNI_GRAY_IMAGE(Global Namespace)']]], - ['cap_5fopenni_5fimage_5fgenerator_231',['CAP_OPENNI_IMAGE_GENERATOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a88571cf323ed746cfad77160272fe593',1,'cv::CAP_OPENNI_IMAGE_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a88571cf323ed746cfad77160272fe593',1,'cv::CAP_OPENNI_IMAGE_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a88571cf323ed746cfad77160272fe593',1,'CAP_OPENNI_IMAGE_GENERATOR(Global Namespace)']]], - ['cap_5fopenni_5fimage_5fgenerator_5foutput_5fmode_232',['CAP_OPENNI_IMAGE_GENERATOR_OUTPUT_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a241b67030848f3bcf223d18ebfe75adc',1,'cv::CAP_OPENNI_IMAGE_GENERATOR_OUTPUT_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a241b67030848f3bcf223d18ebfe75adc',1,'cv::CAP_OPENNI_IMAGE_GENERATOR_OUTPUT_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a241b67030848f3bcf223d18ebfe75adc',1,'CAP_OPENNI_IMAGE_GENERATOR_OUTPUT_MODE(Global Namespace)']]], - ['cap_5fopenni_5fimage_5fgenerator_5fpresent_233',['CAP_OPENNI_IMAGE_GENERATOR_PRESENT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966ab1d78bb8b7e062f4bc14d7db3eccf9b9',1,'cv::CAP_OPENNI_IMAGE_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966ab1d78bb8b7e062f4bc14d7db3eccf9b9',1,'cv::CAP_OPENNI_IMAGE_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966ab1d78bb8b7e062f4bc14d7db3eccf9b9',1,'CAP_OPENNI_IMAGE_GENERATOR_PRESENT(Global Namespace)']]], - ['cap_5fopenni_5fir_5fgenerator_234',['CAP_OPENNI_IR_GENERATOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a895744d25aea6269227db6d4d2b30e68',1,'cv::CAP_OPENNI_IR_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a895744d25aea6269227db6d4d2b30e68',1,'cv::CAP_OPENNI_IR_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a895744d25aea6269227db6d4d2b30e68',1,'CAP_OPENNI_IR_GENERATOR(Global Namespace)']]], - ['cap_5fopenni_5fir_5fgenerator_5fpresent_235',['CAP_OPENNI_IR_GENERATOR_PRESENT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a60014cf8395b41a0918be79e63ef0a03',1,'cv::CAP_OPENNI_IR_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a60014cf8395b41a0918be79e63ef0a03',1,'cv::CAP_OPENNI_IR_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a60014cf8395b41a0918be79e63ef0a03',1,'CAP_OPENNI_IR_GENERATOR_PRESENT(Global Namespace)']]], - ['cap_5fopenni_5fir_5fimage_236',['CAP_OPENNI_IR_IMAGE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a39da5760ecb602bb5f31b2889ee7f9ae',1,'cv::CAP_OPENNI_IR_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a39da5760ecb602bb5f31b2889ee7f9ae',1,'cv::CAP_OPENNI_IR_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a39da5760ecb602bb5f31b2889ee7f9ae',1,'CAP_OPENNI_IR_IMAGE(Global Namespace)']]], - ['cap_5fopenni_5fpoint_5fcloud_5fmap_237',['CAP_OPENNI_POINT_CLOUD_MAP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a9025b0faf50e561b874405f7013f43dd',1,'cv::CAP_OPENNI_POINT_CLOUD_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a9025b0faf50e561b874405f7013f43dd',1,'cv::CAP_OPENNI_POINT_CLOUD_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a9025b0faf50e561b874405f7013f43dd',1,'CAP_OPENNI_POINT_CLOUD_MAP(Global Namespace)']]], - ['cap_5fopenni_5fqvga_5f30hz_238',['CAP_OPENNI_QVGA_30HZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa6ae35b3670500dd309e0797781ffc46b',1,'cv::CAP_OPENNI_QVGA_30HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa6ae35b3670500dd309e0797781ffc46b',1,'cv::CAP_OPENNI_QVGA_30HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa6ae35b3670500dd309e0797781ffc46b',1,'CAP_OPENNI_QVGA_30HZ(Global Namespace)']]], - ['cap_5fopenni_5fqvga_5f60hz_239',['CAP_OPENNI_QVGA_60HZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa5db747b95207d3086eff4e58ce68f495',1,'cv::CAP_OPENNI_QVGA_60HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa5db747b95207d3086eff4e58ce68f495',1,'cv::CAP_OPENNI_QVGA_60HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa5db747b95207d3086eff4e58ce68f495',1,'CAP_OPENNI_QVGA_60HZ(Global Namespace)']]], - ['cap_5fopenni_5fsxga_5f15hz_240',['CAP_OPENNI_SXGA_15HZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfaac4de9c7e74b115c82b996e5a9de738b',1,'cv::CAP_OPENNI_SXGA_15HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfaac4de9c7e74b115c82b996e5a9de738b',1,'cv::CAP_OPENNI_SXGA_15HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfaac4de9c7e74b115c82b996e5a9de738b',1,'CAP_OPENNI_SXGA_15HZ(Global Namespace)']]], - ['cap_5fopenni_5fsxga_5f30hz_241',['CAP_OPENNI_SXGA_30HZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa170b676fb0471be44394d7c600787872',1,'cv::CAP_OPENNI_SXGA_30HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa170b676fb0471be44394d7c600787872',1,'cv::CAP_OPENNI_SXGA_30HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa170b676fb0471be44394d7c600787872',1,'CAP_OPENNI_SXGA_30HZ(Global Namespace)']]], - ['cap_5fopenni_5fvalid_5fdepth_5fmask_242',['CAP_OPENNI_VALID_DEPTH_MASK',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a4cc33615f4869c0a2eda62587b945fb9',1,'cv::CAP_OPENNI_VALID_DEPTH_MASK'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a4cc33615f4869c0a2eda62587b945fb9',1,'cv::CAP_OPENNI_VALID_DEPTH_MASK'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a4cc33615f4869c0a2eda62587b945fb9',1,'CAP_OPENNI_VALID_DEPTH_MASK(Global Namespace)']]], - ['cap_5fopenni_5fvga_5f30hz_243',['CAP_OPENNI_VGA_30HZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa08a35a2f66b2d645eb7817e852ff8ddc',1,'cv::CAP_OPENNI_VGA_30HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa08a35a2f66b2d645eb7817e852ff8ddc',1,'cv::CAP_OPENNI_VGA_30HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa08a35a2f66b2d645eb7817e852ff8ddc',1,'CAP_OPENNI_VGA_30HZ(Global Namespace)']]], - ['cap_5fprop_5faperture_244',['CAP_PROP_APERTURE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa368193e813f38cd561e44c432ac035d0',1,'cv::CAP_PROP_APERTURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa368193e813f38cd561e44c432ac035d0',1,'cv::CAP_PROP_APERTURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa368193e813f38cd561e44c432ac035d0',1,'CAP_PROP_APERTURE(Global Namespace)']]], - ['cap_5fprop_5fauto_5fexposure_245',['CAP_PROP_AUTO_EXPOSURE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da5c790a640b290f73fcd279e8bbaf0f13',1,'cv::CAP_PROP_AUTO_EXPOSURE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da5c790a640b290f73fcd279e8bbaf0f13',1,'CAP_PROP_AUTO_EXPOSURE(Global Namespace)']]], - ['cap_5fprop_5fauto_5fwb_246',['CAP_PROP_AUTO_WB',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da762391cbaa101c4015e6a935aa0cfc95',1,'cv::CAP_PROP_AUTO_WB'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da762391cbaa101c4015e6a935aa0cfc95',1,'CAP_PROP_AUTO_WB(Global Namespace)']]], - ['cap_5fprop_5fautofocus_247',['CAP_PROP_AUTOFOCUS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad937a854bd8d1ca73edfb3570e799aa3',1,'cv::CAP_PROP_AUTOFOCUS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad937a854bd8d1ca73edfb3570e799aa3',1,'CAP_PROP_AUTOFOCUS(Global Namespace)']]], - ['cap_5fprop_5fbackend_248',['CAP_PROP_BACKEND',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da0bdf71aedd96f43adf1dc007cc2cff85',1,'cv::CAP_PROP_BACKEND'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da0bdf71aedd96f43adf1dc007cc2cff85',1,'CAP_PROP_BACKEND(Global Namespace)']]], - ['cap_5fprop_5fbacklight_249',['CAP_PROP_BACKLIGHT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da291cc06a405ecd99d074d051d98a3931',1,'cv::CAP_PROP_BACKLIGHT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da291cc06a405ecd99d074d051d98a3931',1,'CAP_PROP_BACKLIGHT(Global Namespace)']]], - ['cap_5fprop_5fbrightness_250',['CAP_PROP_BRIGHTNESS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da95753013fd8f0c0af3f743dc0293844b',1,'cv::CAP_PROP_BRIGHTNESS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da95753013fd8f0c0af3f743dc0293844b',1,'CAP_PROP_BRIGHTNESS(Global Namespace)']]], - ['cap_5fprop_5fbuffersize_251',['CAP_PROP_BUFFERSIZE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da5014616457bfb833d3ec00c4b7f31342',1,'cv::CAP_PROP_BUFFERSIZE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da5014616457bfb833d3ec00c4b7f31342',1,'CAP_PROP_BUFFERSIZE(Global Namespace)']]], - ['cap_5fprop_5fchannel_252',['CAP_PROP_CHANNEL',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da2f6d968016612b1d87c9895e75a6449a',1,'cv::CAP_PROP_CHANNEL'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da2f6d968016612b1d87c9895e75a6449a',1,'CAP_PROP_CHANNEL(Global Namespace)']]], - ['cap_5fprop_5fcodec_5fpixel_5fformat_253',['CAP_PROP_CODEC_PIXEL_FORMAT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6221cfac2d7ab4d84b38bff91949fa6c',1,'cv::CAP_PROP_CODEC_PIXEL_FORMAT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6221cfac2d7ab4d84b38bff91949fa6c',1,'CAP_PROP_CODEC_PIXEL_FORMAT(Global Namespace)']]], - ['cap_5fprop_5fcontrast_254',['CAP_PROP_CONTRAST',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dae412ca134669abd128476d5afe41e29c',1,'cv::CAP_PROP_CONTRAST'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dae412ca134669abd128476d5afe41e29c',1,'CAP_PROP_CONTRAST(Global Namespace)']]], - ['cap_5fprop_5fconvert_5frgb_255',['CAP_PROP_CONVERT_RGB',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad0bb457c76e2b01024ecb3a85e75af29',1,'cv::CAP_PROP_CONVERT_RGB'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad0bb457c76e2b01024ecb3a85e75af29',1,'CAP_PROP_CONVERT_RGB(Global Namespace)']]], - ['cap_5fprop_5fdc1394_5fmax_256',['CAP_PROP_DC1394_MAX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8abb0d92c98e8d5017993b699661eac161',1,'cv::CAP_PROP_DC1394_MAX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8abb0d92c98e8d5017993b699661eac161',1,'cv::CAP_PROP_DC1394_MAX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8abb0d92c98e8d5017993b699661eac161',1,'CAP_PROP_DC1394_MAX(Global Namespace)']]], - ['cap_5fprop_5fdc1394_5fmode_5fauto_257',['CAP_PROP_DC1394_MODE_AUTO',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8adbadd629b9386316a1837103d147e180',1,'cv::CAP_PROP_DC1394_MODE_AUTO'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8adbadd629b9386316a1837103d147e180',1,'cv::CAP_PROP_DC1394_MODE_AUTO'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8adbadd629b9386316a1837103d147e180',1,'CAP_PROP_DC1394_MODE_AUTO(Global Namespace)']]], - ['cap_5fprop_5fdc1394_5fmode_5fmanual_258',['CAP_PROP_DC1394_MODE_MANUAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8ad4e4849dd1d36d22ae451ae9241cf780',1,'cv::CAP_PROP_DC1394_MODE_MANUAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8ad4e4849dd1d36d22ae451ae9241cf780',1,'cv::CAP_PROP_DC1394_MODE_MANUAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8ad4e4849dd1d36d22ae451ae9241cf780',1,'CAP_PROP_DC1394_MODE_MANUAL(Global Namespace)']]], - ['cap_5fprop_5fdc1394_5fmode_5fone_5fpush_5fauto_259',['CAP_PROP_DC1394_MODE_ONE_PUSH_AUTO',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8a93ed17f4467068f9fb5d0b72cff48cfd',1,'cv::CAP_PROP_DC1394_MODE_ONE_PUSH_AUTO'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8a93ed17f4467068f9fb5d0b72cff48cfd',1,'cv::CAP_PROP_DC1394_MODE_ONE_PUSH_AUTO'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8a93ed17f4467068f9fb5d0b72cff48cfd',1,'CAP_PROP_DC1394_MODE_ONE_PUSH_AUTO(Global Namespace)']]], - ['cap_5fprop_5fdc1394_5foff_260',['CAP_PROP_DC1394_OFF',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8acf2cc1c71097ed0b4a41835469c7442f',1,'cv::CAP_PROP_DC1394_OFF'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8acf2cc1c71097ed0b4a41835469c7442f',1,'cv::CAP_PROP_DC1394_OFF'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8acf2cc1c71097ed0b4a41835469c7442f',1,'CAP_PROP_DC1394_OFF(Global Namespace)']]], - ['cap_5fprop_5fexposure_261',['CAP_PROP_EXPOSURE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dafb6cd2b43344f0458c13863354989623',1,'cv::CAP_PROP_EXPOSURE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dafb6cd2b43344f0458c13863354989623',1,'CAP_PROP_EXPOSURE(Global Namespace)']]], - ['cap_5fprop_5fexposureprogram_262',['CAP_PROP_EXPOSUREPROGRAM',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa32983621756658f76b5f0ab5388940d7',1,'cv::CAP_PROP_EXPOSUREPROGRAM'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa32983621756658f76b5f0ab5388940d7',1,'cv::CAP_PROP_EXPOSUREPROGRAM'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa32983621756658f76b5f0ab5388940d7',1,'CAP_PROP_EXPOSUREPROGRAM(Global Namespace)']]], - ['cap_5fprop_5ffocus_263',['CAP_PROP_FOCUS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da25fe3d87b62a918427d49f3d43aef714',1,'cv::CAP_PROP_FOCUS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da25fe3d87b62a918427d49f3d43aef714',1,'CAP_PROP_FOCUS(Global Namespace)']]], - ['cap_5fprop_5fformat_264',['CAP_PROP_FORMAT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da171e1ed33a7c1280a9d2c869732f226c',1,'cv::CAP_PROP_FORMAT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da171e1ed33a7c1280a9d2c869732f226c',1,'CAP_PROP_FORMAT(Global Namespace)']]], - ['cap_5fprop_5ffourcc_265',['CAP_PROP_FOURCC',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da53e1c28d4c2ca10732af106f3bf00613',1,'cv::CAP_PROP_FOURCC'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da53e1c28d4c2ca10732af106f3bf00613',1,'CAP_PROP_FOURCC(Global Namespace)']]], - ['cap_5fprop_5ffps_266',['CAP_PROP_FPS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daf01bc92359d2abc9e6eeb5cbe36d9af2',1,'cv::CAP_PROP_FPS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daf01bc92359d2abc9e6eeb5cbe36d9af2',1,'CAP_PROP_FPS(Global Namespace)']]], - ['cap_5fprop_5fframe_5fcount_267',['CAP_PROP_FRAME_COUNT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dadadc646b31cfd2194794a3a80b8fa6c2',1,'cv::CAP_PROP_FRAME_COUNT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dadadc646b31cfd2194794a3a80b8fa6c2',1,'CAP_PROP_FRAME_COUNT(Global Namespace)']]], - ['cap_5fprop_5fframe_5fheight_268',['CAP_PROP_FRAME_HEIGHT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad8b57083fd9bd58e0f94e68a54b42b7e',1,'cv::CAP_PROP_FRAME_HEIGHT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad8b57083fd9bd58e0f94e68a54b42b7e',1,'CAP_PROP_FRAME_HEIGHT(Global Namespace)']]], - ['cap_5fprop_5fframe_5fwidth_269',['CAP_PROP_FRAME_WIDTH',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dab26d2ba37086662261148e9fe93eecad',1,'cv::CAP_PROP_FRAME_WIDTH'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dab26d2ba37086662261148e9fe93eecad',1,'CAP_PROP_FRAME_WIDTH(Global Namespace)']]], - ['cap_5fprop_5fgain_270',['CAP_PROP_GAIN',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daf2ead561c823ccfbbd9889c8ac690b75',1,'cv::CAP_PROP_GAIN'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daf2ead561c823ccfbbd9889c8ac690b75',1,'CAP_PROP_GAIN(Global Namespace)']]], - ['cap_5fprop_5fgamma_271',['CAP_PROP_GAMMA',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da16f82a926e5e1003ed420e12b37753b1',1,'cv::CAP_PROP_GAMMA'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da16f82a926e5e1003ed420e12b37753b1',1,'CAP_PROP_GAMMA(Global Namespace)']]], - ['cap_5fprop_5fgiga_5fframe_5fheigh_5fmax_272',['CAP_PROP_GIGA_FRAME_HEIGH_MAX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fafa8cdf9c627d7264bf7f9d77e4a8437f',1,'cv::CAP_PROP_GIGA_FRAME_HEIGH_MAX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fafa8cdf9c627d7264bf7f9d77e4a8437f',1,'cv::CAP_PROP_GIGA_FRAME_HEIGH_MAX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fafa8cdf9c627d7264bf7f9d77e4a8437f',1,'CAP_PROP_GIGA_FRAME_HEIGH_MAX(Global Namespace)']]], - ['cap_5fprop_5fgiga_5fframe_5foffset_5fx_273',['CAP_PROP_GIGA_FRAME_OFFSET_X',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fae548de03f852996b9ba5e5adfbbbce93',1,'cv::CAP_PROP_GIGA_FRAME_OFFSET_X'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fae548de03f852996b9ba5e5adfbbbce93',1,'cv::CAP_PROP_GIGA_FRAME_OFFSET_X'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fae548de03f852996b9ba5e5adfbbbce93',1,'CAP_PROP_GIGA_FRAME_OFFSET_X(Global Namespace)']]], - ['cap_5fprop_5fgiga_5fframe_5foffset_5fy_274',['CAP_PROP_GIGA_FRAME_OFFSET_Y',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fafb8d98d9ad34d6d74bdbeff2f5197111',1,'cv::CAP_PROP_GIGA_FRAME_OFFSET_Y'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fafb8d98d9ad34d6d74bdbeff2f5197111',1,'cv::CAP_PROP_GIGA_FRAME_OFFSET_Y'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fafb8d98d9ad34d6d74bdbeff2f5197111',1,'CAP_PROP_GIGA_FRAME_OFFSET_Y(Global Namespace)']]], - ['cap_5fprop_5fgiga_5fframe_5fsens_5fheigh_275',['CAP_PROP_GIGA_FRAME_SENS_HEIGH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194faee1202dad37d4dd3f02f9fa42e149b23',1,'cv::CAP_PROP_GIGA_FRAME_SENS_HEIGH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194faee1202dad37d4dd3f02f9fa42e149b23',1,'cv::CAP_PROP_GIGA_FRAME_SENS_HEIGH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194faee1202dad37d4dd3f02f9fa42e149b23',1,'CAP_PROP_GIGA_FRAME_SENS_HEIGH(Global Namespace)']]], - ['cap_5fprop_5fgiga_5fframe_5fsens_5fwidth_276',['CAP_PROP_GIGA_FRAME_SENS_WIDTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fa9330b5353a86ba5dfc522859fb3ec8d9',1,'cv::CAP_PROP_GIGA_FRAME_SENS_WIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fa9330b5353a86ba5dfc522859fb3ec8d9',1,'cv::CAP_PROP_GIGA_FRAME_SENS_WIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fa9330b5353a86ba5dfc522859fb3ec8d9',1,'CAP_PROP_GIGA_FRAME_SENS_WIDTH(Global Namespace)']]], - ['cap_5fprop_5fgiga_5fframe_5fwidth_5fmax_277',['CAP_PROP_GIGA_FRAME_WIDTH_MAX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194faa72a12bf66268d701e80113a2b7767fc',1,'cv::CAP_PROP_GIGA_FRAME_WIDTH_MAX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194faa72a12bf66268d701e80113a2b7767fc',1,'cv::CAP_PROP_GIGA_FRAME_WIDTH_MAX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194faa72a12bf66268d701e80113a2b7767fc',1,'CAP_PROP_GIGA_FRAME_WIDTH_MAX(Global Namespace)']]], - ['cap_5fprop_5fgphoto2_5fcollect_5fmsgs_278',['CAP_PROP_GPHOTO2_COLLECT_MSGS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daaa50f65192f6dd5970282ed6bea335731',1,'cv::CAP_PROP_GPHOTO2_COLLECT_MSGS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daaa50f65192f6dd5970282ed6bea335731',1,'cv::CAP_PROP_GPHOTO2_COLLECT_MSGS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daaa50f65192f6dd5970282ed6bea335731',1,'CAP_PROP_GPHOTO2_COLLECT_MSGS(Global Namespace)']]], - ['cap_5fprop_5fgphoto2_5fflush_5fmsgs_279',['CAP_PROP_GPHOTO2_FLUSH_MSGS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa12383f3e93113560c8f01d7abc8b1607',1,'cv::CAP_PROP_GPHOTO2_FLUSH_MSGS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa12383f3e93113560c8f01d7abc8b1607',1,'cv::CAP_PROP_GPHOTO2_FLUSH_MSGS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa12383f3e93113560c8f01d7abc8b1607',1,'CAP_PROP_GPHOTO2_FLUSH_MSGS(Global Namespace)']]], - ['cap_5fprop_5fgphoto2_5fpreview_280',['CAP_PROP_GPHOTO2_PREVIEW',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daad68866e163722ca095ebb063759201bd',1,'cv::CAP_PROP_GPHOTO2_PREVIEW'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daad68866e163722ca095ebb063759201bd',1,'cv::CAP_PROP_GPHOTO2_PREVIEW'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daad68866e163722ca095ebb063759201bd',1,'CAP_PROP_GPHOTO2_PREVIEW(Global Namespace)']]], - ['cap_5fprop_5fgphoto2_5freload_5fconfig_281',['CAP_PROP_GPHOTO2_RELOAD_CONFIG',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa842f6beebf68e379a6be441979709e07',1,'cv::CAP_PROP_GPHOTO2_RELOAD_CONFIG'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa842f6beebf68e379a6be441979709e07',1,'cv::CAP_PROP_GPHOTO2_RELOAD_CONFIG'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa842f6beebf68e379a6be441979709e07',1,'CAP_PROP_GPHOTO2_RELOAD_CONFIG(Global Namespace)']]], - ['cap_5fprop_5fgphoto2_5freload_5fon_5fchange_282',['CAP_PROP_GPHOTO2_RELOAD_ON_CHANGE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa794abce1a061930e32d362f4ec1dd9e9',1,'cv::CAP_PROP_GPHOTO2_RELOAD_ON_CHANGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa794abce1a061930e32d362f4ec1dd9e9',1,'cv::CAP_PROP_GPHOTO2_RELOAD_ON_CHANGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa794abce1a061930e32d362f4ec1dd9e9',1,'CAP_PROP_GPHOTO2_RELOAD_ON_CHANGE(Global Namespace)']]], - ['cap_5fprop_5fgphoto2_5fwidget_5fenumerate_283',['CAP_PROP_GPHOTO2_WIDGET_ENUMERATE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daad6f05f89311dc09cfaf828c8b91b6d18',1,'cv::CAP_PROP_GPHOTO2_WIDGET_ENUMERATE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daad6f05f89311dc09cfaf828c8b91b6d18',1,'cv::CAP_PROP_GPHOTO2_WIDGET_ENUMERATE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daad6f05f89311dc09cfaf828c8b91b6d18',1,'CAP_PROP_GPHOTO2_WIDGET_ENUMERATE(Global Namespace)']]], - ['cap_5fprop_5fgstreamer_5fqueue_5flength_284',['CAP_PROP_GSTREAMER_QUEUE_LENGTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga7879653f5149fe92a14bc0ba3430b9b4a15017e3dbe8d23bf4081b71d35e71bdf',1,'cv::CAP_PROP_GSTREAMER_QUEUE_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga7879653f5149fe92a14bc0ba3430b9b4a15017e3dbe8d23bf4081b71d35e71bdf',1,'cv::CAP_PROP_GSTREAMER_QUEUE_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga7879653f5149fe92a14bc0ba3430b9b4a15017e3dbe8d23bf4081b71d35e71bdf',1,'CAP_PROP_GSTREAMER_QUEUE_LENGTH(Global Namespace)']]], - ['cap_5fprop_5fguid_285',['CAP_PROP_GUID',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa33343b2bee43f96c3f8c4f4d809d040',1,'cv::CAP_PROP_GUID'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa33343b2bee43f96c3f8c4f4d809d040',1,'CAP_PROP_GUID(Global Namespace)']]], - ['cap_5fprop_5fhue_286',['CAP_PROP_HUE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa9800b2246d653480facbf02a3d1109b',1,'cv::CAP_PROP_HUE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa9800b2246d653480facbf02a3d1109b',1,'CAP_PROP_HUE(Global Namespace)']]], - ['cap_5fprop_5fimages_5fbase_287',['CAP_PROP_IMAGES_BASE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggad354fdd0fcc8202f7624903c065bef06afde4916d952c3a893b2dfb809f2b75e6',1,'cv::CAP_PROP_IMAGES_BASE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggad354fdd0fcc8202f7624903c065bef06afde4916d952c3a893b2dfb809f2b75e6',1,'cv::CAP_PROP_IMAGES_BASE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggad354fdd0fcc8202f7624903c065bef06afde4916d952c3a893b2dfb809f2b75e6',1,'CAP_PROP_IMAGES_BASE(Global Namespace)']]], - ['cap_5fprop_5fimages_5flast_288',['CAP_PROP_IMAGES_LAST',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggad354fdd0fcc8202f7624903c065bef06a419c7f8af9ed15c0b641b8c0201355c4',1,'cv::CAP_PROP_IMAGES_LAST'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggad354fdd0fcc8202f7624903c065bef06a419c7f8af9ed15c0b641b8c0201355c4',1,'cv::CAP_PROP_IMAGES_LAST'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggad354fdd0fcc8202f7624903c065bef06a419c7f8af9ed15c0b641b8c0201355c4',1,'CAP_PROP_IMAGES_LAST(Global Namespace)']]], - ['cap_5fprop_5fintelperc_5fdepth_5fconfidence_5fthreshold_289',['CAP_PROP_INTELPERC_DEPTH_CONFIDENCE_THRESHOLD',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765ac3f7024c4c8555f8927fa093aa31dd62',1,'cv::CAP_PROP_INTELPERC_DEPTH_CONFIDENCE_THRESHOLD'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765ac3f7024c4c8555f8927fa093aa31dd62',1,'cv::CAP_PROP_INTELPERC_DEPTH_CONFIDENCE_THRESHOLD'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765ac3f7024c4c8555f8927fa093aa31dd62',1,'CAP_PROP_INTELPERC_DEPTH_CONFIDENCE_THRESHOLD(Global Namespace)']]], - ['cap_5fprop_5fintelperc_5fdepth_5ffocal_5flength_5fhorz_290',['CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_HORZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a07423906d8a904f7997292878a5c78f0',1,'cv::CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_HORZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a07423906d8a904f7997292878a5c78f0',1,'cv::CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_HORZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a07423906d8a904f7997292878a5c78f0',1,'CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_HORZ(Global Namespace)']]], - ['cap_5fprop_5fintelperc_5fdepth_5ffocal_5flength_5fvert_291',['CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_VERT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a647281df465ac37cdc9e199f1fb9ca3c',1,'cv::CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_VERT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a647281df465ac37cdc9e199f1fb9ca3c',1,'cv::CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_VERT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a647281df465ac37cdc9e199f1fb9ca3c',1,'CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_VERT(Global Namespace)']]], - ['cap_5fprop_5fintelperc_5fdepth_5flow_5fconfidence_5fvalue_292',['CAP_PROP_INTELPERC_DEPTH_LOW_CONFIDENCE_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a0096091135b3fa213dbeed6a103d8b58',1,'cv::CAP_PROP_INTELPERC_DEPTH_LOW_CONFIDENCE_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a0096091135b3fa213dbeed6a103d8b58',1,'cv::CAP_PROP_INTELPERC_DEPTH_LOW_CONFIDENCE_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a0096091135b3fa213dbeed6a103d8b58',1,'CAP_PROP_INTELPERC_DEPTH_LOW_CONFIDENCE_VALUE(Global Namespace)']]], - ['cap_5fprop_5fintelperc_5fdepth_5fsaturation_5fvalue_293',['CAP_PROP_INTELPERC_DEPTH_SATURATION_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765acc9291ae9c5beec367fb701cabcaaf0e',1,'cv::CAP_PROP_INTELPERC_DEPTH_SATURATION_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765acc9291ae9c5beec367fb701cabcaaf0e',1,'cv::CAP_PROP_INTELPERC_DEPTH_SATURATION_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765acc9291ae9c5beec367fb701cabcaaf0e',1,'CAP_PROP_INTELPERC_DEPTH_SATURATION_VALUE(Global Namespace)']]], - ['cap_5fprop_5fintelperc_5fprofile_5fcount_294',['CAP_PROP_INTELPERC_PROFILE_COUNT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a61e601c701375c5e43d43754ddf6d030',1,'cv::CAP_PROP_INTELPERC_PROFILE_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a61e601c701375c5e43d43754ddf6d030',1,'cv::CAP_PROP_INTELPERC_PROFILE_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a61e601c701375c5e43d43754ddf6d030',1,'CAP_PROP_INTELPERC_PROFILE_COUNT(Global Namespace)']]], - ['cap_5fprop_5fintelperc_5fprofile_5fidx_295',['CAP_PROP_INTELPERC_PROFILE_IDX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a03489c9c3fc5b2656a9063f2e079d7a3',1,'cv::CAP_PROP_INTELPERC_PROFILE_IDX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a03489c9c3fc5b2656a9063f2e079d7a3',1,'cv::CAP_PROP_INTELPERC_PROFILE_IDX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a03489c9c3fc5b2656a9063f2e079d7a3',1,'CAP_PROP_INTELPERC_PROFILE_IDX(Global Namespace)']]], - ['cap_5fprop_5fios_5fdevice_5fexposure_296',['CAP_PROP_IOS_DEVICE_EXPOSURE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927aea912356d2f5707561b5a7d44e11fa00',1,'cv::CAP_PROP_IOS_DEVICE_EXPOSURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927aea912356d2f5707561b5a7d44e11fa00',1,'cv::CAP_PROP_IOS_DEVICE_EXPOSURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927aea912356d2f5707561b5a7d44e11fa00',1,'CAP_PROP_IOS_DEVICE_EXPOSURE(Global Namespace)']]], - ['cap_5fprop_5fios_5fdevice_5fflash_297',['CAP_PROP_IOS_DEVICE_FLASH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a7d18d0bbcc2094dd9cc8214afa52f70a',1,'cv::CAP_PROP_IOS_DEVICE_FLASH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a7d18d0bbcc2094dd9cc8214afa52f70a',1,'cv::CAP_PROP_IOS_DEVICE_FLASH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a7d18d0bbcc2094dd9cc8214afa52f70a',1,'CAP_PROP_IOS_DEVICE_FLASH(Global Namespace)']]], - ['cap_5fprop_5fios_5fdevice_5ffocus_298',['CAP_PROP_IOS_DEVICE_FOCUS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a049085d744de6023c0b4b263e16ce9ff',1,'cv::CAP_PROP_IOS_DEVICE_FOCUS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a049085d744de6023c0b4b263e16ce9ff',1,'cv::CAP_PROP_IOS_DEVICE_FOCUS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a049085d744de6023c0b4b263e16ce9ff',1,'CAP_PROP_IOS_DEVICE_FOCUS(Global Namespace)']]], - ['cap_5fprop_5fios_5fdevice_5ftorch_299',['CAP_PROP_IOS_DEVICE_TORCH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a0f5c7fcd82d2eb877eb299419caf7ac6',1,'cv::CAP_PROP_IOS_DEVICE_TORCH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a0f5c7fcd82d2eb877eb299419caf7ac6',1,'cv::CAP_PROP_IOS_DEVICE_TORCH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a0f5c7fcd82d2eb877eb299419caf7ac6',1,'CAP_PROP_IOS_DEVICE_TORCH(Global Namespace)']]], - ['cap_5fprop_5fios_5fdevice_5fwhitebalance_300',['CAP_PROP_IOS_DEVICE_WHITEBALANCE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a709a5efd2ef0842ba866c494c844e784',1,'cv::CAP_PROP_IOS_DEVICE_WHITEBALANCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a709a5efd2ef0842ba866c494c844e784',1,'cv::CAP_PROP_IOS_DEVICE_WHITEBALANCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a709a5efd2ef0842ba866c494c844e784',1,'CAP_PROP_IOS_DEVICE_WHITEBALANCE(Global Namespace)']]], - ['cap_5fprop_5firis_301',['CAP_PROP_IRIS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6fad0580db4515df0b5f5e4b05ee94fc',1,'cv::CAP_PROP_IRIS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6fad0580db4515df0b5f5e4b05ee94fc',1,'CAP_PROP_IRIS(Global Namespace)']]], - ['cap_5fprop_5fiso_5fspeed_302',['CAP_PROP_ISO_SPEED',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6f7abc33bd385769da80a33926445f9e',1,'cv::CAP_PROP_ISO_SPEED'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6f7abc33bd385769da80a33926445f9e',1,'CAP_PROP_ISO_SPEED(Global Namespace)']]], - ['cap_5fprop_5fmode_303',['CAP_PROP_MODE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dae45a994f35020bf149050dcb2a02da72',1,'cv::CAP_PROP_MODE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dae45a994f35020bf149050dcb2a02da72',1,'CAP_PROP_MODE(Global Namespace)']]], - ['cap_5fprop_5fmonochrome_304',['CAP_PROP_MONOCHROME',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dab48ba74e66e91d91722e036b322fb2a3',1,'cv::CAP_PROP_MONOCHROME'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dab48ba74e66e91d91722e036b322fb2a3',1,'CAP_PROP_MONOCHROME(Global Namespace)']]], - ['cap_5fprop_5fopenni2_5fmirror_305',['CAP_PROP_OPENNI2_MIRROR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba4d176582d7510d1dd24816916134178f',1,'cv::CAP_PROP_OPENNI2_MIRROR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba4d176582d7510d1dd24816916134178f',1,'cv::CAP_PROP_OPENNI2_MIRROR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba4d176582d7510d1dd24816916134178f',1,'CAP_PROP_OPENNI2_MIRROR(Global Namespace)']]], - ['cap_5fprop_5fopenni2_5fsync_306',['CAP_PROP_OPENNI2_SYNC',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaa3b67d0d527dde2b44abb117eee5f289',1,'cv::CAP_PROP_OPENNI2_SYNC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaa3b67d0d527dde2b44abb117eee5f289',1,'cv::CAP_PROP_OPENNI2_SYNC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaa3b67d0d527dde2b44abb117eee5f289',1,'CAP_PROP_OPENNI2_SYNC(Global Namespace)']]], - ['cap_5fprop_5fopenni_5fapprox_5fframe_5fsync_307',['CAP_PROP_OPENNI_APPROX_FRAME_SYNC',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaf675327cdfd8a83dd87d8e90b34479bb',1,'cv::CAP_PROP_OPENNI_APPROX_FRAME_SYNC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaf675327cdfd8a83dd87d8e90b34479bb',1,'cv::CAP_PROP_OPENNI_APPROX_FRAME_SYNC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaf675327cdfd8a83dd87d8e90b34479bb',1,'CAP_PROP_OPENNI_APPROX_FRAME_SYNC(Global Namespace)']]], - ['cap_5fprop_5fopenni_5fbaseline_308',['CAP_PROP_OPENNI_BASELINE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba676d008cfa53522d7d118d34ff66336b',1,'cv::CAP_PROP_OPENNI_BASELINE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba676d008cfa53522d7d118d34ff66336b',1,'cv::CAP_PROP_OPENNI_BASELINE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba676d008cfa53522d7d118d34ff66336b',1,'CAP_PROP_OPENNI_BASELINE(Global Namespace)']]], - ['cap_5fprop_5fopenni_5fcircle_5fbuffer_309',['CAP_PROP_OPENNI_CIRCLE_BUFFER',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba580f8871db885f3dc6bdfcc0abcef9a8',1,'cv::CAP_PROP_OPENNI_CIRCLE_BUFFER'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba580f8871db885f3dc6bdfcc0abcef9a8',1,'cv::CAP_PROP_OPENNI_CIRCLE_BUFFER'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba580f8871db885f3dc6bdfcc0abcef9a8',1,'CAP_PROP_OPENNI_CIRCLE_BUFFER(Global Namespace)']]], - ['cap_5fprop_5fopenni_5ffocal_5flength_310',['CAP_PROP_OPENNI_FOCAL_LENGTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba8103ade90d890b2b0a9d0cef99e59dc1',1,'cv::CAP_PROP_OPENNI_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba8103ade90d890b2b0a9d0cef99e59dc1',1,'cv::CAP_PROP_OPENNI_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba8103ade90d890b2b0a9d0cef99e59dc1',1,'CAP_PROP_OPENNI_FOCAL_LENGTH(Global Namespace)']]], - ['cap_5fprop_5fopenni_5fframe_5fmax_5fdepth_311',['CAP_PROP_OPENNI_FRAME_MAX_DEPTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaf1babc6cc545ca6774f1690b9c32a036',1,'cv::CAP_PROP_OPENNI_FRAME_MAX_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaf1babc6cc545ca6774f1690b9c32a036',1,'cv::CAP_PROP_OPENNI_FRAME_MAX_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaf1babc6cc545ca6774f1690b9c32a036',1,'CAP_PROP_OPENNI_FRAME_MAX_DEPTH(Global Namespace)']]], - ['cap_5fprop_5fopenni_5fgenerator_5fpresent_312',['CAP_PROP_OPENNI_GENERATOR_PRESENT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaa821a4784e36e4f40aa9e212537851e8',1,'cv::CAP_PROP_OPENNI_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaa821a4784e36e4f40aa9e212537851e8',1,'cv::CAP_PROP_OPENNI_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaa821a4784e36e4f40aa9e212537851e8',1,'CAP_PROP_OPENNI_GENERATOR_PRESENT(Global Namespace)']]], - ['cap_5fprop_5fopenni_5fmax_5fbuffer_5fsize_313',['CAP_PROP_OPENNI_MAX_BUFFER_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba1512aa312e7db87684e323e7b440f63c',1,'cv::CAP_PROP_OPENNI_MAX_BUFFER_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba1512aa312e7db87684e323e7b440f63c',1,'cv::CAP_PROP_OPENNI_MAX_BUFFER_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba1512aa312e7db87684e323e7b440f63c',1,'CAP_PROP_OPENNI_MAX_BUFFER_SIZE(Global Namespace)']]], - ['cap_5fprop_5fopenni_5fmax_5ftime_5fduration_314',['CAP_PROP_OPENNI_MAX_TIME_DURATION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba0d36810d3a75e7d53292b2307b873ff6',1,'cv::CAP_PROP_OPENNI_MAX_TIME_DURATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba0d36810d3a75e7d53292b2307b873ff6',1,'cv::CAP_PROP_OPENNI_MAX_TIME_DURATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba0d36810d3a75e7d53292b2307b873ff6',1,'CAP_PROP_OPENNI_MAX_TIME_DURATION(Global Namespace)']]], - ['cap_5fprop_5fopenni_5foutput_5fmode_315',['CAP_PROP_OPENNI_OUTPUT_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbabcda142aeb58988856fe78d762e66de4',1,'cv::CAP_PROP_OPENNI_OUTPUT_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbabcda142aeb58988856fe78d762e66de4',1,'cv::CAP_PROP_OPENNI_OUTPUT_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbabcda142aeb58988856fe78d762e66de4',1,'CAP_PROP_OPENNI_OUTPUT_MODE(Global Namespace)']]], - ['cap_5fprop_5fopenni_5fregistration_316',['CAP_PROP_OPENNI_REGISTRATION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba051eab1e624d79b5b3b297883eaab23f',1,'cv::CAP_PROP_OPENNI_REGISTRATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba051eab1e624d79b5b3b297883eaab23f',1,'cv::CAP_PROP_OPENNI_REGISTRATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba051eab1e624d79b5b3b297883eaab23f',1,'CAP_PROP_OPENNI_REGISTRATION(Global Namespace)']]], - ['cap_5fprop_5fopenni_5fregistration_5fon_317',['CAP_PROP_OPENNI_REGISTRATION_ON',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba66af01b2664b79aa76689ade0935736e',1,'cv::CAP_PROP_OPENNI_REGISTRATION_ON'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba66af01b2664b79aa76689ade0935736e',1,'cv::CAP_PROP_OPENNI_REGISTRATION_ON'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba66af01b2664b79aa76689ade0935736e',1,'CAP_PROP_OPENNI_REGISTRATION_ON(Global Namespace)']]], - ['cap_5fprop_5fpan_318',['CAP_PROP_PAN',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da976bd262a1efb96781c9a675dd461d5e',1,'cv::CAP_PROP_PAN'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da976bd262a1efb96781c9a675dd461d5e',1,'CAP_PROP_PAN(Global Namespace)']]], - ['cap_5fprop_5fpos_5favi_5fratio_319',['CAP_PROP_POS_AVI_RATIO',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da7b235a04f50a444bc2dc72f5ae394aaf',1,'cv::CAP_PROP_POS_AVI_RATIO'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da7b235a04f50a444bc2dc72f5ae394aaf',1,'CAP_PROP_POS_AVI_RATIO(Global Namespace)']]], - ['cap_5fprop_5fpos_5fframes_320',['CAP_PROP_POS_FRAMES',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6223452891755166a4fd5173ea257068',1,'cv::CAP_PROP_POS_FRAMES'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6223452891755166a4fd5173ea257068',1,'CAP_PROP_POS_FRAMES(Global Namespace)']]], - ['cap_5fprop_5fpos_5fmsec_321',['CAP_PROP_POS_MSEC',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da7c2fa550ba270713fca1405397b90ae0',1,'cv::CAP_PROP_POS_MSEC'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da7c2fa550ba270713fca1405397b90ae0',1,'CAP_PROP_POS_MSEC(Global Namespace)']]], - ['cap_5fprop_5fpvapi_5fbinningx_322',['CAP_PROP_PVAPI_BINNINGX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175adc35a809d39b76611bbddfbe1d262de9',1,'cv::CAP_PROP_PVAPI_BINNINGX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175adc35a809d39b76611bbddfbe1d262de9',1,'cv::CAP_PROP_PVAPI_BINNINGX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175adc35a809d39b76611bbddfbe1d262de9',1,'CAP_PROP_PVAPI_BINNINGX(Global Namespace)']]], - ['cap_5fprop_5fpvapi_5fbinningy_323',['CAP_PROP_PVAPI_BINNINGY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175ad09164e443627dd9fffae73c17e26ff5',1,'cv::CAP_PROP_PVAPI_BINNINGY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175ad09164e443627dd9fffae73c17e26ff5',1,'cv::CAP_PROP_PVAPI_BINNINGY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175ad09164e443627dd9fffae73c17e26ff5',1,'CAP_PROP_PVAPI_BINNINGY(Global Namespace)']]], - ['cap_5fprop_5fpvapi_5fdecimationhorizontal_324',['CAP_PROP_PVAPI_DECIMATIONHORIZONTAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175ad10d97cf35c6cdba377ba9ed7f4df457',1,'cv::CAP_PROP_PVAPI_DECIMATIONHORIZONTAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175ad10d97cf35c6cdba377ba9ed7f4df457',1,'cv::CAP_PROP_PVAPI_DECIMATIONHORIZONTAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175ad10d97cf35c6cdba377ba9ed7f4df457',1,'CAP_PROP_PVAPI_DECIMATIONHORIZONTAL(Global Namespace)']]], - ['cap_5fprop_5fpvapi_5fdecimationvertical_325',['CAP_PROP_PVAPI_DECIMATIONVERTICAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a15037da6569b943b91364be21af58ede',1,'cv::CAP_PROP_PVAPI_DECIMATIONVERTICAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a15037da6569b943b91364be21af58ede',1,'cv::CAP_PROP_PVAPI_DECIMATIONVERTICAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a15037da6569b943b91364be21af58ede',1,'CAP_PROP_PVAPI_DECIMATIONVERTICAL(Global Namespace)']]], - ['cap_5fprop_5fpvapi_5fframestarttriggermode_326',['CAP_PROP_PVAPI_FRAMESTARTTRIGGERMODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a337f6f1806a65c7e9b4bf33f96b46008',1,'cv::CAP_PROP_PVAPI_FRAMESTARTTRIGGERMODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a337f6f1806a65c7e9b4bf33f96b46008',1,'cv::CAP_PROP_PVAPI_FRAMESTARTTRIGGERMODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a337f6f1806a65c7e9b4bf33f96b46008',1,'CAP_PROP_PVAPI_FRAMESTARTTRIGGERMODE(Global Namespace)']]], - ['cap_5fprop_5fpvapi_5fmulticastip_327',['CAP_PROP_PVAPI_MULTICASTIP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a4c1e342f7800bb32f5994170c71b107b',1,'cv::CAP_PROP_PVAPI_MULTICASTIP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a4c1e342f7800bb32f5994170c71b107b',1,'cv::CAP_PROP_PVAPI_MULTICASTIP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a4c1e342f7800bb32f5994170c71b107b',1,'CAP_PROP_PVAPI_MULTICASTIP(Global Namespace)']]], - ['cap_5fprop_5fpvapi_5fpixelformat_328',['CAP_PROP_PVAPI_PIXELFORMAT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175af398d565fa74a15b5336cd7d7b4875c1',1,'cv::CAP_PROP_PVAPI_PIXELFORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175af398d565fa74a15b5336cd7d7b4875c1',1,'cv::CAP_PROP_PVAPI_PIXELFORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175af398d565fa74a15b5336cd7d7b4875c1',1,'CAP_PROP_PVAPI_PIXELFORMAT(Global Namespace)']]], - ['cap_5fprop_5frectification_329',['CAP_PROP_RECTIFICATION',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da0471d0b2b6fe06f6977a41bbe56b46b5',1,'cv::CAP_PROP_RECTIFICATION'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da0471d0b2b6fe06f6977a41bbe56b46b5',1,'CAP_PROP_RECTIFICATION(Global Namespace)']]], - ['cap_5fprop_5froll_330',['CAP_PROP_ROLL',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dab8ccf2e54a73af3d0f1249cbc9c21445',1,'cv::CAP_PROP_ROLL'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dab8ccf2e54a73af3d0f1249cbc9c21445',1,'CAP_PROP_ROLL(Global Namespace)']]], - ['cap_5fprop_5fsar_5fden_331',['CAP_PROP_SAR_DEN',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daaac79210a04c7a75815be9dfbf78eaf1',1,'cv::CAP_PROP_SAR_DEN'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daaac79210a04c7a75815be9dfbf78eaf1',1,'CAP_PROP_SAR_DEN(Global Namespace)']]], - ['cap_5fprop_5fsar_5fnum_332',['CAP_PROP_SAR_NUM',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da4fc3ef1222d9a8be3d7b6d044494a523',1,'cv::CAP_PROP_SAR_NUM'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da4fc3ef1222d9a8be3d7b6d044494a523',1,'CAP_PROP_SAR_NUM(Global Namespace)']]], - ['cap_5fprop_5fsaturation_333',['CAP_PROP_SATURATION',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da2495072c1b81de961e5b9f601bc4aab3',1,'cv::CAP_PROP_SATURATION'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da2495072c1b81de961e5b9f601bc4aab3',1,'CAP_PROP_SATURATION(Global Namespace)']]], - ['cap_5fprop_5fsettings_334',['CAP_PROP_SETTINGS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6339d098548d91f438b6f10ee1407c72',1,'cv::CAP_PROP_SETTINGS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6339d098548d91f438b6f10ee1407c72',1,'CAP_PROP_SETTINGS(Global Namespace)']]], - ['cap_5fprop_5fsharpness_335',['CAP_PROP_SHARPNESS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa4cff86666811a91654c34ea05eef368',1,'cv::CAP_PROP_SHARPNESS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa4cff86666811a91654c34ea05eef368',1,'CAP_PROP_SHARPNESS(Global Namespace)']]], - ['cap_5fprop_5fspeed_336',['CAP_PROP_SPEED',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daae9be75bcff2e935ddae1f5b09941c462',1,'cv::CAP_PROP_SPEED'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daae9be75bcff2e935ddae1f5b09941c462',1,'cv::CAP_PROP_SPEED'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daae9be75bcff2e935ddae1f5b09941c462',1,'CAP_PROP_SPEED(Global Namespace)']]], - ['cap_5fprop_5ftemperature_337',['CAP_PROP_TEMPERATURE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da4471c47a983494d88844aa313e599a5f',1,'cv::CAP_PROP_TEMPERATURE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da4471c47a983494d88844aa313e599a5f',1,'CAP_PROP_TEMPERATURE(Global Namespace)']]], - ['cap_5fprop_5ftilt_338',['CAP_PROP_TILT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad126234b7a8bd92a50fc075461a99778',1,'cv::CAP_PROP_TILT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad126234b7a8bd92a50fc075461a99778',1,'CAP_PROP_TILT(Global Namespace)']]], - ['cap_5fprop_5ftrigger_339',['CAP_PROP_TRIGGER',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa157bb0c323279596cbed43a8d8d7827',1,'cv::CAP_PROP_TRIGGER'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa157bb0c323279596cbed43a8d8d7827',1,'CAP_PROP_TRIGGER(Global Namespace)']]], - ['cap_5fprop_5ftrigger_5fdelay_340',['CAP_PROP_TRIGGER_DELAY',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da97bdb876e58d2b5e0b6958a1cc195eac',1,'cv::CAP_PROP_TRIGGER_DELAY'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da97bdb876e58d2b5e0b6958a1cc195eac',1,'CAP_PROP_TRIGGER_DELAY(Global Namespace)']]], - ['cap_5fprop_5fviewfinder_341',['CAP_PROP_VIEWFINDER',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daabe08426b291b533a4cf61a7e4e7d1324',1,'cv::CAP_PROP_VIEWFINDER'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daabe08426b291b533a4cf61a7e4e7d1324',1,'cv::CAP_PROP_VIEWFINDER'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daabe08426b291b533a4cf61a7e4e7d1324',1,'CAP_PROP_VIEWFINDER(Global Namespace)']]], - ['cap_5fprop_5fwb_5ftemperature_342',['CAP_PROP_WB_TEMPERATURE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da280eb4a13368f5ccdea3b2233dbc25b6',1,'cv::CAP_PROP_WB_TEMPERATURE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da280eb4a13368f5ccdea3b2233dbc25b6',1,'CAP_PROP_WB_TEMPERATURE(Global Namespace)']]], - ['cap_5fprop_5fwhite_5fbalance_5fblue_5fu_343',['CAP_PROP_WHITE_BALANCE_BLUE_U',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dafe7719e51138b49c8fd9c7c71d5121a9',1,'cv::CAP_PROP_WHITE_BALANCE_BLUE_U'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dafe7719e51138b49c8fd9c7c71d5121a9',1,'CAP_PROP_WHITE_BALANCE_BLUE_U(Global Namespace)']]], - ['cap_5fprop_5fwhite_5fbalance_5fred_5fv_344',['CAP_PROP_WHITE_BALANCE_RED_V',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da4da437eb05a5af70b080254027acc5e0',1,'cv::CAP_PROP_WHITE_BALANCE_RED_V'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da4da437eb05a5af70b080254027acc5e0',1,'CAP_PROP_WHITE_BALANCE_RED_V(Global Namespace)']]], - ['cap_5fprop_5fxi_5facq_5fbuffer_5fsize_345',['CAP_PROP_XI_ACQ_BUFFER_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa29dd84cf215e0f439a66fe868455cdd',1,'cv::CAP_PROP_XI_ACQ_BUFFER_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa29dd84cf215e0f439a66fe868455cdd',1,'cv::CAP_PROP_XI_ACQ_BUFFER_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa29dd84cf215e0f439a66fe868455cdd',1,'CAP_PROP_XI_ACQ_BUFFER_SIZE(Global Namespace)']]], - ['cap_5fprop_5fxi_5facq_5fbuffer_5fsize_5funit_346',['CAP_PROP_XI_ACQ_BUFFER_SIZE_UNIT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca541d2ca1825e3fbdf0e850558e82b242',1,'cv::CAP_PROP_XI_ACQ_BUFFER_SIZE_UNIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca541d2ca1825e3fbdf0e850558e82b242',1,'cv::CAP_PROP_XI_ACQ_BUFFER_SIZE_UNIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca541d2ca1825e3fbdf0e850558e82b242',1,'CAP_PROP_XI_ACQ_BUFFER_SIZE_UNIT(Global Namespace)']]], - ['cap_5fprop_5fxi_5facq_5fframe_5fburst_5fcount_347',['CAP_PROP_XI_ACQ_FRAME_BURST_COUNT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca74fe2c1fa26066f63ceb698fd24e1b24',1,'cv::CAP_PROP_XI_ACQ_FRAME_BURST_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca74fe2c1fa26066f63ceb698fd24e1b24',1,'cv::CAP_PROP_XI_ACQ_FRAME_BURST_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca74fe2c1fa26066f63ceb698fd24e1b24',1,'CAP_PROP_XI_ACQ_FRAME_BURST_COUNT(Global Namespace)']]], - ['cap_5fprop_5fxi_5facq_5ftiming_5fmode_348',['CAP_PROP_XI_ACQ_TIMING_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabfc1c4c1d54741960f234e782d5be2af',1,'cv::CAP_PROP_XI_ACQ_TIMING_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabfc1c4c1d54741960f234e782d5be2af',1,'cv::CAP_PROP_XI_ACQ_TIMING_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabfc1c4c1d54741960f234e782d5be2af',1,'CAP_PROP_XI_ACQ_TIMING_MODE(Global Namespace)']]], - ['cap_5fprop_5fxi_5facq_5ftransport_5fbuffer_5fcommit_349',['CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_COMMIT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca898f4934777168695360effbefd4b3e7',1,'cv::CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_COMMIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca898f4934777168695360effbefd4b3e7',1,'cv::CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_COMMIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca898f4934777168695360effbefd4b3e7',1,'CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_COMMIT(Global Namespace)']]], - ['cap_5fprop_5fxi_5facq_5ftransport_5fbuffer_5fsize_350',['CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac93e79a0df6b8383b383d0c3e377e832',1,'cv::CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac93e79a0df6b8383b383d0c3e377e832',1,'cv::CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac93e79a0df6b8383b383d0c3e377e832',1,'CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_SIZE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fae_5fmax_5flimit_351',['CAP_PROP_XI_AE_MAX_LIMIT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaab0ce44b1aa17d4f82678aeebcd1deb5',1,'cv::CAP_PROP_XI_AE_MAX_LIMIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaab0ce44b1aa17d4f82678aeebcd1deb5',1,'cv::CAP_PROP_XI_AE_MAX_LIMIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaab0ce44b1aa17d4f82678aeebcd1deb5',1,'CAP_PROP_XI_AE_MAX_LIMIT(Global Namespace)']]], - ['cap_5fprop_5fxi_5faeag_352',['CAP_PROP_XI_AEAG',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9eb8e60a7c1ec79d620d194f2bb3deba',1,'cv::CAP_PROP_XI_AEAG'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9eb8e60a7c1ec79d620d194f2bb3deba',1,'cv::CAP_PROP_XI_AEAG'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9eb8e60a7c1ec79d620d194f2bb3deba',1,'CAP_PROP_XI_AEAG(Global Namespace)']]], - ['cap_5fprop_5fxi_5faeag_5flevel_353',['CAP_PROP_XI_AEAG_LEVEL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1df2a23c5ac1d3b0e690d634a23f3815',1,'cv::CAP_PROP_XI_AEAG_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1df2a23c5ac1d3b0e690d634a23f3815',1,'cv::CAP_PROP_XI_AEAG_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1df2a23c5ac1d3b0e690d634a23f3815',1,'CAP_PROP_XI_AEAG_LEVEL(Global Namespace)']]], - ['cap_5fprop_5fxi_5faeag_5froi_5fheight_354',['CAP_PROP_XI_AEAG_ROI_HEIGHT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaef5ce8e8556233335e9771c5a13cf646',1,'cv::CAP_PROP_XI_AEAG_ROI_HEIGHT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaef5ce8e8556233335e9771c5a13cf646',1,'cv::CAP_PROP_XI_AEAG_ROI_HEIGHT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaef5ce8e8556233335e9771c5a13cf646',1,'CAP_PROP_XI_AEAG_ROI_HEIGHT(Global Namespace)']]], - ['cap_5fprop_5fxi_5faeag_5froi_5foffset_5fx_355',['CAP_PROP_XI_AEAG_ROI_OFFSET_X',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca39e41c91baf6f63c17af16eca11854f8',1,'cv::CAP_PROP_XI_AEAG_ROI_OFFSET_X'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca39e41c91baf6f63c17af16eca11854f8',1,'cv::CAP_PROP_XI_AEAG_ROI_OFFSET_X'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca39e41c91baf6f63c17af16eca11854f8',1,'CAP_PROP_XI_AEAG_ROI_OFFSET_X(Global Namespace)']]], - ['cap_5fprop_5fxi_5faeag_5froi_5foffset_5fy_356',['CAP_PROP_XI_AEAG_ROI_OFFSET_Y',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca46b7791d22180493c94beef20d98fe94',1,'cv::CAP_PROP_XI_AEAG_ROI_OFFSET_Y'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca46b7791d22180493c94beef20d98fe94',1,'cv::CAP_PROP_XI_AEAG_ROI_OFFSET_Y'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca46b7791d22180493c94beef20d98fe94',1,'CAP_PROP_XI_AEAG_ROI_OFFSET_Y(Global Namespace)']]], - ['cap_5fprop_5fxi_5faeag_5froi_5fwidth_357',['CAP_PROP_XI_AEAG_ROI_WIDTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacbd2426abe20e582a878d7621951bf1a',1,'cv::CAP_PROP_XI_AEAG_ROI_WIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacbd2426abe20e582a878d7621951bf1a',1,'cv::CAP_PROP_XI_AEAG_ROI_WIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacbd2426abe20e582a878d7621951bf1a',1,'CAP_PROP_XI_AEAG_ROI_WIDTH(Global Namespace)']]], - ['cap_5fprop_5fxi_5fag_5fmax_5flimit_358',['CAP_PROP_XI_AG_MAX_LIMIT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8d1beac67e7dffae82f72b9a91922e02',1,'cv::CAP_PROP_XI_AG_MAX_LIMIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8d1beac67e7dffae82f72b9a91922e02',1,'cv::CAP_PROP_XI_AG_MAX_LIMIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8d1beac67e7dffae82f72b9a91922e02',1,'CAP_PROP_XI_AG_MAX_LIMIT(Global Namespace)']]], - ['cap_5fprop_5fxi_5fapply_5fcms_359',['CAP_PROP_XI_APPLY_CMS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab5f0a4155a300bd53ee69539a405fe41',1,'cv::CAP_PROP_XI_APPLY_CMS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab5f0a4155a300bd53ee69539a405fe41',1,'cv::CAP_PROP_XI_APPLY_CMS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab5f0a4155a300bd53ee69539a405fe41',1,'CAP_PROP_XI_APPLY_CMS(Global Namespace)']]], - ['cap_5fprop_5fxi_5fauto_5fbandwidth_5fcalculation_360',['CAP_PROP_XI_AUTO_BANDWIDTH_CALCULATION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac689b604605532a1e1b4da825b4b8315',1,'cv::CAP_PROP_XI_AUTO_BANDWIDTH_CALCULATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac689b604605532a1e1b4da825b4b8315',1,'cv::CAP_PROP_XI_AUTO_BANDWIDTH_CALCULATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac689b604605532a1e1b4da825b4b8315',1,'CAP_PROP_XI_AUTO_BANDWIDTH_CALCULATION(Global Namespace)']]], - ['cap_5fprop_5fxi_5fauto_5fwb_361',['CAP_PROP_XI_AUTO_WB',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca78726921e8b31b899e12e1b7aa7acc0b',1,'cv::CAP_PROP_XI_AUTO_WB'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca78726921e8b31b899e12e1b7aa7acc0b',1,'cv::CAP_PROP_XI_AUTO_WB'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca78726921e8b31b899e12e1b7aa7acc0b',1,'CAP_PROP_XI_AUTO_WB(Global Namespace)']]], - ['cap_5fprop_5fxi_5favailable_5fbandwidth_362',['CAP_PROP_XI_AVAILABLE_BANDWIDTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca93c8b6cca33f3a341502e1f05471e980',1,'cv::CAP_PROP_XI_AVAILABLE_BANDWIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca93c8b6cca33f3a341502e1f05471e980',1,'cv::CAP_PROP_XI_AVAILABLE_BANDWIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca93c8b6cca33f3a341502e1f05471e980',1,'CAP_PROP_XI_AVAILABLE_BANDWIDTH(Global Namespace)']]], - ['cap_5fprop_5fxi_5fbinning_5fhorizontal_363',['CAP_PROP_XI_BINNING_HORIZONTAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8ad99a5e916acc75fcc7721feb34a317',1,'cv::CAP_PROP_XI_BINNING_HORIZONTAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8ad99a5e916acc75fcc7721feb34a317',1,'cv::CAP_PROP_XI_BINNING_HORIZONTAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8ad99a5e916acc75fcc7721feb34a317',1,'CAP_PROP_XI_BINNING_HORIZONTAL(Global Namespace)']]], - ['cap_5fprop_5fxi_5fbinning_5fpattern_364',['CAP_PROP_XI_BINNING_PATTERN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab06c8c58619c511dac584a2f75e3d7ad',1,'cv::CAP_PROP_XI_BINNING_PATTERN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab06c8c58619c511dac584a2f75e3d7ad',1,'cv::CAP_PROP_XI_BINNING_PATTERN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab06c8c58619c511dac584a2f75e3d7ad',1,'CAP_PROP_XI_BINNING_PATTERN(Global Namespace)']]], - ['cap_5fprop_5fxi_5fbinning_5fselector_365',['CAP_PROP_XI_BINNING_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca13057f6fa93855d14425fccd23bb83ec',1,'cv::CAP_PROP_XI_BINNING_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca13057f6fa93855d14425fccd23bb83ec',1,'cv::CAP_PROP_XI_BINNING_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca13057f6fa93855d14425fccd23bb83ec',1,'CAP_PROP_XI_BINNING_SELECTOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5fbinning_5fvertical_366',['CAP_PROP_XI_BINNING_VERTICAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0199f71e8c1c122580bca052ec01f985',1,'cv::CAP_PROP_XI_BINNING_VERTICAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0199f71e8c1c122580bca052ec01f985',1,'cv::CAP_PROP_XI_BINNING_VERTICAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0199f71e8c1c122580bca052ec01f985',1,'CAP_PROP_XI_BINNING_VERTICAL(Global Namespace)']]], - ['cap_5fprop_5fxi_5fbpc_367',['CAP_PROP_XI_BPC',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8e96da9798b9d04931b78f161d860068',1,'cv::CAP_PROP_XI_BPC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8e96da9798b9d04931b78f161d860068',1,'cv::CAP_PROP_XI_BPC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8e96da9798b9d04931b78f161d860068',1,'CAP_PROP_XI_BPC(Global Namespace)']]], - ['cap_5fprop_5fxi_5fbuffer_5fpolicy_368',['CAP_PROP_XI_BUFFER_POLICY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca928df33def77f34c5c7f311858f25c48',1,'cv::CAP_PROP_XI_BUFFER_POLICY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca928df33def77f34c5c7f311858f25c48',1,'cv::CAP_PROP_XI_BUFFER_POLICY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca928df33def77f34c5c7f311858f25c48',1,'CAP_PROP_XI_BUFFER_POLICY(Global Namespace)']]], - ['cap_5fprop_5fxi_5fbuffers_5fqueue_5fsize_369',['CAP_PROP_XI_BUFFERS_QUEUE_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca656141833befd21f204c7d9f7687b9cf',1,'cv::CAP_PROP_XI_BUFFERS_QUEUE_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca656141833befd21f204c7d9f7687b9cf',1,'cv::CAP_PROP_XI_BUFFERS_QUEUE_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca656141833befd21f204c7d9f7687b9cf',1,'CAP_PROP_XI_BUFFERS_QUEUE_SIZE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f00_370',['CAP_PROP_XI_CC_MATRIX_00',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3f848989fa4782daed55e6d66db49f75',1,'cv::CAP_PROP_XI_CC_MATRIX_00'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3f848989fa4782daed55e6d66db49f75',1,'cv::CAP_PROP_XI_CC_MATRIX_00'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3f848989fa4782daed55e6d66db49f75',1,'CAP_PROP_XI_CC_MATRIX_00(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f01_371',['CAP_PROP_XI_CC_MATRIX_01',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca95e27d9c6825f62a75f6e5925a10a660',1,'cv::CAP_PROP_XI_CC_MATRIX_01'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca95e27d9c6825f62a75f6e5925a10a660',1,'cv::CAP_PROP_XI_CC_MATRIX_01'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca95e27d9c6825f62a75f6e5925a10a660',1,'CAP_PROP_XI_CC_MATRIX_01(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f02_372',['CAP_PROP_XI_CC_MATRIX_02',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac24b38753dc61ea5a34e8e24cb1b7ebb',1,'cv::CAP_PROP_XI_CC_MATRIX_02'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac24b38753dc61ea5a34e8e24cb1b7ebb',1,'cv::CAP_PROP_XI_CC_MATRIX_02'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac24b38753dc61ea5a34e8e24cb1b7ebb',1,'CAP_PROP_XI_CC_MATRIX_02(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f03_373',['CAP_PROP_XI_CC_MATRIX_03',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab4dc65aa8bf1e3264c130f2ca438ebbd',1,'cv::CAP_PROP_XI_CC_MATRIX_03'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab4dc65aa8bf1e3264c130f2ca438ebbd',1,'cv::CAP_PROP_XI_CC_MATRIX_03'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab4dc65aa8bf1e3264c130f2ca438ebbd',1,'CAP_PROP_XI_CC_MATRIX_03(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f10_374',['CAP_PROP_XI_CC_MATRIX_10',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa680ef94ac047467b30eb19d0ab9e3e1',1,'cv::CAP_PROP_XI_CC_MATRIX_10'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa680ef94ac047467b30eb19d0ab9e3e1',1,'cv::CAP_PROP_XI_CC_MATRIX_10'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa680ef94ac047467b30eb19d0ab9e3e1',1,'CAP_PROP_XI_CC_MATRIX_10(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f11_375',['CAP_PROP_XI_CC_MATRIX_11',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca88e6261d6402965b2188dffa5da40a3e',1,'cv::CAP_PROP_XI_CC_MATRIX_11'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca88e6261d6402965b2188dffa5da40a3e',1,'cv::CAP_PROP_XI_CC_MATRIX_11'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca88e6261d6402965b2188dffa5da40a3e',1,'CAP_PROP_XI_CC_MATRIX_11(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f12_376',['CAP_PROP_XI_CC_MATRIX_12',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaebd3e3ef66d136f30d7ae884775d92e5',1,'cv::CAP_PROP_XI_CC_MATRIX_12'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaebd3e3ef66d136f30d7ae884775d92e5',1,'cv::CAP_PROP_XI_CC_MATRIX_12'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaebd3e3ef66d136f30d7ae884775d92e5',1,'CAP_PROP_XI_CC_MATRIX_12(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f13_377',['CAP_PROP_XI_CC_MATRIX_13',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf90a703023bce0fa393089f8944167fb',1,'cv::CAP_PROP_XI_CC_MATRIX_13'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf90a703023bce0fa393089f8944167fb',1,'cv::CAP_PROP_XI_CC_MATRIX_13'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf90a703023bce0fa393089f8944167fb',1,'CAP_PROP_XI_CC_MATRIX_13(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f20_378',['CAP_PROP_XI_CC_MATRIX_20',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca03c5b9f730df89e85d3c1f9f062f8477',1,'cv::CAP_PROP_XI_CC_MATRIX_20'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca03c5b9f730df89e85d3c1f9f062f8477',1,'cv::CAP_PROP_XI_CC_MATRIX_20'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca03c5b9f730df89e85d3c1f9f062f8477',1,'CAP_PROP_XI_CC_MATRIX_20(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f21_379',['CAP_PROP_XI_CC_MATRIX_21',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1e9e100b5881d8bec3749279e9b0a18f',1,'cv::CAP_PROP_XI_CC_MATRIX_21'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1e9e100b5881d8bec3749279e9b0a18f',1,'cv::CAP_PROP_XI_CC_MATRIX_21'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1e9e100b5881d8bec3749279e9b0a18f',1,'CAP_PROP_XI_CC_MATRIX_21(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f22_380',['CAP_PROP_XI_CC_MATRIX_22',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad39c4868d1fd828a13301c4e3a484c1a',1,'cv::CAP_PROP_XI_CC_MATRIX_22'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad39c4868d1fd828a13301c4e3a484c1a',1,'cv::CAP_PROP_XI_CC_MATRIX_22'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad39c4868d1fd828a13301c4e3a484c1a',1,'CAP_PROP_XI_CC_MATRIX_22(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f23_381',['CAP_PROP_XI_CC_MATRIX_23',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad32906e25f6e4b3b7a721f019980a2df',1,'cv::CAP_PROP_XI_CC_MATRIX_23'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad32906e25f6e4b3b7a721f019980a2df',1,'cv::CAP_PROP_XI_CC_MATRIX_23'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad32906e25f6e4b3b7a721f019980a2df',1,'CAP_PROP_XI_CC_MATRIX_23(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f30_382',['CAP_PROP_XI_CC_MATRIX_30',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacb9360352011126b2c5b22f00d2bc825',1,'cv::CAP_PROP_XI_CC_MATRIX_30'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacb9360352011126b2c5b22f00d2bc825',1,'cv::CAP_PROP_XI_CC_MATRIX_30'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacb9360352011126b2c5b22f00d2bc825',1,'CAP_PROP_XI_CC_MATRIX_30(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f31_383',['CAP_PROP_XI_CC_MATRIX_31',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5f0675b49efc4bf8afa8c3e5a021f947',1,'cv::CAP_PROP_XI_CC_MATRIX_31'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5f0675b49efc4bf8afa8c3e5a021f947',1,'cv::CAP_PROP_XI_CC_MATRIX_31'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5f0675b49efc4bf8afa8c3e5a021f947',1,'CAP_PROP_XI_CC_MATRIX_31(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f32_384',['CAP_PROP_XI_CC_MATRIX_32',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac7a263f10e2aa915d0db21d000f677dd',1,'cv::CAP_PROP_XI_CC_MATRIX_32'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac7a263f10e2aa915d0db21d000f677dd',1,'cv::CAP_PROP_XI_CC_MATRIX_32'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac7a263f10e2aa915d0db21d000f677dd',1,'CAP_PROP_XI_CC_MATRIX_32(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcc_5fmatrix_5f33_385',['CAP_PROP_XI_CC_MATRIX_33',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca56a526385841cb1b73c311b9ab3cd6f8',1,'cv::CAP_PROP_XI_CC_MATRIX_33'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca56a526385841cb1b73c311b9ab3cd6f8',1,'cv::CAP_PROP_XI_CC_MATRIX_33'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca56a526385841cb1b73c311b9ab3cd6f8',1,'CAP_PROP_XI_CC_MATRIX_33(Global Namespace)']]], - ['cap_5fprop_5fxi_5fchip_5ftemp_386',['CAP_PROP_XI_CHIP_TEMP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaabb95af76be80f6b87680c4b257f98ee',1,'cv::CAP_PROP_XI_CHIP_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaabb95af76be80f6b87680c4b257f98ee',1,'cv::CAP_PROP_XI_CHIP_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaabb95af76be80f6b87680c4b257f98ee',1,'CAP_PROP_XI_CHIP_TEMP(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcms_387',['CAP_PROP_XI_CMS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4b9de3101c09c901dd98a0f9b64b807a',1,'cv::CAP_PROP_XI_CMS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4b9de3101c09c901dd98a0f9b64b807a',1,'cv::CAP_PROP_XI_CMS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4b9de3101c09c901dd98a0f9b64b807a',1,'CAP_PROP_XI_CMS(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcolor_5ffilter_5farray_388',['CAP_PROP_XI_COLOR_FILTER_ARRAY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca43d1598de031e32b1573edd86971f397',1,'cv::CAP_PROP_XI_COLOR_FILTER_ARRAY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca43d1598de031e32b1573edd86971f397',1,'cv::CAP_PROP_XI_COLOR_FILTER_ARRAY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca43d1598de031e32b1573edd86971f397',1,'CAP_PROP_XI_COLOR_FILTER_ARRAY(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcolumn_5ffpn_5fcorrection_389',['CAP_PROP_XI_COLUMN_FPN_CORRECTION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5799261a0420d625f4f9e3ef3ac141fd',1,'cv::CAP_PROP_XI_COLUMN_FPN_CORRECTION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5799261a0420d625f4f9e3ef3ac141fd',1,'cv::CAP_PROP_XI_COLUMN_FPN_CORRECTION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5799261a0420d625f4f9e3ef3ac141fd',1,'CAP_PROP_XI_COLUMN_FPN_CORRECTION(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcooling_390',['CAP_PROP_XI_COOLING',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa2272098bfa67902996bc6908acb1f1c',1,'cv::CAP_PROP_XI_COOLING'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa2272098bfa67902996bc6908acb1f1c',1,'cv::CAP_PROP_XI_COOLING'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa2272098bfa67902996bc6908acb1f1c',1,'CAP_PROP_XI_COOLING(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcounter_5fselector_391',['CAP_PROP_XI_COUNTER_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab26bfa6487516f5a1c1422fa914de7b0',1,'cv::CAP_PROP_XI_COUNTER_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab26bfa6487516f5a1c1422fa914de7b0',1,'cv::CAP_PROP_XI_COUNTER_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab26bfa6487516f5a1c1422fa914de7b0',1,'CAP_PROP_XI_COUNTER_SELECTOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5fcounter_5fvalue_392',['CAP_PROP_XI_COUNTER_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1936978811c685c26c945937b62f56e3',1,'cv::CAP_PROP_XI_COUNTER_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1936978811c685c26c945937b62f56e3',1,'cv::CAP_PROP_XI_COUNTER_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1936978811c685c26c945937b62f56e3',1,'CAP_PROP_XI_COUNTER_VALUE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdata_5fformat_393',['CAP_PROP_XI_DATA_FORMAT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca78102975f149dfb80b657f2d4a263f56',1,'cv::CAP_PROP_XI_DATA_FORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca78102975f149dfb80b657f2d4a263f56',1,'cv::CAP_PROP_XI_DATA_FORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca78102975f149dfb80b657f2d4a263f56',1,'CAP_PROP_XI_DATA_FORMAT(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdebounce_5fen_394',['CAP_PROP_XI_DEBOUNCE_EN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcafbca56ae9dc4ffa899f971ad3568d357',1,'cv::CAP_PROP_XI_DEBOUNCE_EN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcafbca56ae9dc4ffa899f971ad3568d357',1,'cv::CAP_PROP_XI_DEBOUNCE_EN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcafbca56ae9dc4ffa899f971ad3568d357',1,'CAP_PROP_XI_DEBOUNCE_EN(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdebounce_5fpol_395',['CAP_PROP_XI_DEBOUNCE_POL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab9a4ade923237e2ecd6d28ee091c8979',1,'cv::CAP_PROP_XI_DEBOUNCE_POL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab9a4ade923237e2ecd6d28ee091c8979',1,'cv::CAP_PROP_XI_DEBOUNCE_POL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab9a4ade923237e2ecd6d28ee091c8979',1,'CAP_PROP_XI_DEBOUNCE_POL(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdebounce_5ft0_396',['CAP_PROP_XI_DEBOUNCE_T0',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabc52f65fa1d3a00eaeae28faae42c202',1,'cv::CAP_PROP_XI_DEBOUNCE_T0'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabc52f65fa1d3a00eaeae28faae42c202',1,'cv::CAP_PROP_XI_DEBOUNCE_T0'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabc52f65fa1d3a00eaeae28faae42c202',1,'CAP_PROP_XI_DEBOUNCE_T0(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdebounce_5ft1_397',['CAP_PROP_XI_DEBOUNCE_T1',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad5c9b833300a7a1c219ba1989f2976c4',1,'cv::CAP_PROP_XI_DEBOUNCE_T1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad5c9b833300a7a1c219ba1989f2976c4',1,'cv::CAP_PROP_XI_DEBOUNCE_T1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad5c9b833300a7a1c219ba1989f2976c4',1,'CAP_PROP_XI_DEBOUNCE_T1(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdebug_5flevel_398',['CAP_PROP_XI_DEBUG_LEVEL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca627a30de4f523437febda2d48e29c504',1,'cv::CAP_PROP_XI_DEBUG_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca627a30de4f523437febda2d48e29c504',1,'cv::CAP_PROP_XI_DEBUG_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca627a30de4f523437febda2d48e29c504',1,'CAP_PROP_XI_DEBUG_LEVEL(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdecimation_5fhorizontal_399',['CAP_PROP_XI_DECIMATION_HORIZONTAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcadbba432c72379e77501b3c00f87e5c8c',1,'cv::CAP_PROP_XI_DECIMATION_HORIZONTAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcadbba432c72379e77501b3c00f87e5c8c',1,'cv::CAP_PROP_XI_DECIMATION_HORIZONTAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcadbba432c72379e77501b3c00f87e5c8c',1,'CAP_PROP_XI_DECIMATION_HORIZONTAL(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdecimation_5fpattern_400',['CAP_PROP_XI_DECIMATION_PATTERN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0165a1d34902d00b60da24503bb051f3',1,'cv::CAP_PROP_XI_DECIMATION_PATTERN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0165a1d34902d00b60da24503bb051f3',1,'cv::CAP_PROP_XI_DECIMATION_PATTERN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0165a1d34902d00b60da24503bb051f3',1,'CAP_PROP_XI_DECIMATION_PATTERN(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdecimation_5fselector_401',['CAP_PROP_XI_DECIMATION_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1b9ad18b3612d2e3608ae81f88d77288',1,'cv::CAP_PROP_XI_DECIMATION_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1b9ad18b3612d2e3608ae81f88d77288',1,'cv::CAP_PROP_XI_DECIMATION_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1b9ad18b3612d2e3608ae81f88d77288',1,'CAP_PROP_XI_DECIMATION_SELECTOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdecimation_5fvertical_402',['CAP_PROP_XI_DECIMATION_VERTICAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca62d52331d0200f822501b9e0e747d0e0',1,'cv::CAP_PROP_XI_DECIMATION_VERTICAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca62d52331d0200f822501b9e0e747d0e0',1,'cv::CAP_PROP_XI_DECIMATION_VERTICAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca62d52331d0200f822501b9e0e747d0e0',1,'CAP_PROP_XI_DECIMATION_VERTICAL(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdefault_5fcc_5fmatrix_403',['CAP_PROP_XI_DEFAULT_CC_MATRIX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca32a46b42b8292aa0e6fcf362ee53ed61',1,'cv::CAP_PROP_XI_DEFAULT_CC_MATRIX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca32a46b42b8292aa0e6fcf362ee53ed61',1,'cv::CAP_PROP_XI_DEFAULT_CC_MATRIX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca32a46b42b8292aa0e6fcf362ee53ed61',1,'CAP_PROP_XI_DEFAULT_CC_MATRIX(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdevice_5fmodel_5fid_404',['CAP_PROP_XI_DEVICE_MODEL_ID',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2bec5db0ec17f9c5154ad75303590805',1,'cv::CAP_PROP_XI_DEVICE_MODEL_ID'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2bec5db0ec17f9c5154ad75303590805',1,'cv::CAP_PROP_XI_DEVICE_MODEL_ID'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2bec5db0ec17f9c5154ad75303590805',1,'CAP_PROP_XI_DEVICE_MODEL_ID(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdevice_5freset_405',['CAP_PROP_XI_DEVICE_RESET',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca28bbc3b30b0d6e4ef038f00e867871ef',1,'cv::CAP_PROP_XI_DEVICE_RESET'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca28bbc3b30b0d6e4ef038f00e867871ef',1,'cv::CAP_PROP_XI_DEVICE_RESET'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca28bbc3b30b0d6e4ef038f00e867871ef',1,'CAP_PROP_XI_DEVICE_RESET(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdevice_5fsn_406',['CAP_PROP_XI_DEVICE_SN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacff771ea3b2e38c53377b6e2c148d650',1,'cv::CAP_PROP_XI_DEVICE_SN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacff771ea3b2e38c53377b6e2c148d650',1,'cv::CAP_PROP_XI_DEVICE_SN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacff771ea3b2e38c53377b6e2c148d650',1,'CAP_PROP_XI_DEVICE_SN(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdownsampling_407',['CAP_PROP_XI_DOWNSAMPLING',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0b6409999490a804d1a06df43105e5cb',1,'cv::CAP_PROP_XI_DOWNSAMPLING'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0b6409999490a804d1a06df43105e5cb',1,'cv::CAP_PROP_XI_DOWNSAMPLING'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0b6409999490a804d1a06df43105e5cb',1,'CAP_PROP_XI_DOWNSAMPLING(Global Namespace)']]], - ['cap_5fprop_5fxi_5fdownsampling_5ftype_408',['CAP_PROP_XI_DOWNSAMPLING_TYPE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca206b435824abcca17fc5c405ee3bca44',1,'cv::CAP_PROP_XI_DOWNSAMPLING_TYPE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca206b435824abcca17fc5c405ee3bca44',1,'cv::CAP_PROP_XI_DOWNSAMPLING_TYPE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca206b435824abcca17fc5c405ee3bca44',1,'CAP_PROP_XI_DOWNSAMPLING_TYPE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fexp_5fpriority_409',['CAP_PROP_XI_EXP_PRIORITY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2ef62c529916491a59a4b5cca77bc7af',1,'cv::CAP_PROP_XI_EXP_PRIORITY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2ef62c529916491a59a4b5cca77bc7af',1,'cv::CAP_PROP_XI_EXP_PRIORITY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2ef62c529916491a59a4b5cca77bc7af',1,'CAP_PROP_XI_EXP_PRIORITY(Global Namespace)']]], - ['cap_5fprop_5fxi_5fexposure_410',['CAP_PROP_XI_EXPOSURE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaaa2e2d066a822de98d26f26c5511c805',1,'cv::CAP_PROP_XI_EXPOSURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaaa2e2d066a822de98d26f26c5511c805',1,'cv::CAP_PROP_XI_EXPOSURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaaa2e2d066a822de98d26f26c5511c805',1,'CAP_PROP_XI_EXPOSURE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fexposure_5fburst_5fcount_411',['CAP_PROP_XI_EXPOSURE_BURST_COUNT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca13f4135742d70478e25494bb12dac06d',1,'cv::CAP_PROP_XI_EXPOSURE_BURST_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca13f4135742d70478e25494bb12dac06d',1,'cv::CAP_PROP_XI_EXPOSURE_BURST_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca13f4135742d70478e25494bb12dac06d',1,'CAP_PROP_XI_EXPOSURE_BURST_COUNT(Global Namespace)']]], - ['cap_5fprop_5fxi_5fffs_5faccess_5fkey_412',['CAP_PROP_XI_FFS_ACCESS_KEY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca37f5748b495927f2a92370dd3a296766',1,'cv::CAP_PROP_XI_FFS_ACCESS_KEY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca37f5748b495927f2a92370dd3a296766',1,'cv::CAP_PROP_XI_FFS_ACCESS_KEY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca37f5748b495927f2a92370dd3a296766',1,'CAP_PROP_XI_FFS_ACCESS_KEY(Global Namespace)']]], - ['cap_5fprop_5fxi_5fffs_5ffile_5fid_413',['CAP_PROP_XI_FFS_FILE_ID',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8e843bc6a96b5fb81b45a8f37f00e3e8',1,'cv::CAP_PROP_XI_FFS_FILE_ID'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8e843bc6a96b5fb81b45a8f37f00e3e8',1,'cv::CAP_PROP_XI_FFS_FILE_ID'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8e843bc6a96b5fb81b45a8f37f00e3e8',1,'CAP_PROP_XI_FFS_FILE_ID(Global Namespace)']]], - ['cap_5fprop_5fxi_5fffs_5ffile_5fsize_414',['CAP_PROP_XI_FFS_FILE_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab6d8f3f143d9b3ff663b2877123aaf17',1,'cv::CAP_PROP_XI_FFS_FILE_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab6d8f3f143d9b3ff663b2877123aaf17',1,'cv::CAP_PROP_XI_FFS_FILE_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab6d8f3f143d9b3ff663b2877123aaf17',1,'CAP_PROP_XI_FFS_FILE_SIZE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fframerate_415',['CAP_PROP_XI_FRAMERATE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaed8586ad3c43e4d5761cc4b6a6549374',1,'cv::CAP_PROP_XI_FRAMERATE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaed8586ad3c43e4d5761cc4b6a6549374',1,'cv::CAP_PROP_XI_FRAMERATE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaed8586ad3c43e4d5761cc4b6a6549374',1,'CAP_PROP_XI_FRAMERATE(Global Namespace)']]], - ['cap_5fprop_5fxi_5ffree_5fffs_5fsize_416',['CAP_PROP_XI_FREE_FFS_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaab4b15d9df02a485c1197bdd76a5e7d9',1,'cv::CAP_PROP_XI_FREE_FFS_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaab4b15d9df02a485c1197bdd76a5e7d9',1,'cv::CAP_PROP_XI_FREE_FFS_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaab4b15d9df02a485c1197bdd76a5e7d9',1,'CAP_PROP_XI_FREE_FFS_SIZE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fgain_417',['CAP_PROP_XI_GAIN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2ce2015d26b875f9a5bba2c34efa881f',1,'cv::CAP_PROP_XI_GAIN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2ce2015d26b875f9a5bba2c34efa881f',1,'cv::CAP_PROP_XI_GAIN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2ce2015d26b875f9a5bba2c34efa881f',1,'CAP_PROP_XI_GAIN(Global Namespace)']]], - ['cap_5fprop_5fxi_5fgain_5fselector_418',['CAP_PROP_XI_GAIN_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5c4afbb52928cd2a035b46f90f0b77e7',1,'cv::CAP_PROP_XI_GAIN_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5c4afbb52928cd2a035b46f90f0b77e7',1,'cv::CAP_PROP_XI_GAIN_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5c4afbb52928cd2a035b46f90f0b77e7',1,'CAP_PROP_XI_GAIN_SELECTOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5fgammac_419',['CAP_PROP_XI_GAMMAC',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac51336a614b4d065e6ec6e4c9dbc75d4',1,'cv::CAP_PROP_XI_GAMMAC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac51336a614b4d065e6ec6e4c9dbc75d4',1,'cv::CAP_PROP_XI_GAMMAC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac51336a614b4d065e6ec6e4c9dbc75d4',1,'CAP_PROP_XI_GAMMAC(Global Namespace)']]], - ['cap_5fprop_5fxi_5fgammay_420',['CAP_PROP_XI_GAMMAY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcadec96ba88422b04bb4b8b4f672f5c77b',1,'cv::CAP_PROP_XI_GAMMAY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcadec96ba88422b04bb4b8b4f672f5c77b',1,'cv::CAP_PROP_XI_GAMMAY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcadec96ba88422b04bb4b8b4f672f5c77b',1,'CAP_PROP_XI_GAMMAY(Global Namespace)']]], - ['cap_5fprop_5fxi_5fgpi_5flevel_421',['CAP_PROP_XI_GPI_LEVEL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab44ede586d7a2370e24ae87d6aa8afad',1,'cv::CAP_PROP_XI_GPI_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab44ede586d7a2370e24ae87d6aa8afad',1,'cv::CAP_PROP_XI_GPI_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab44ede586d7a2370e24ae87d6aa8afad',1,'CAP_PROP_XI_GPI_LEVEL(Global Namespace)']]], - ['cap_5fprop_5fxi_5fgpi_5fmode_422',['CAP_PROP_XI_GPI_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4dbdf76832838e9ad4b89da280bdcbca',1,'cv::CAP_PROP_XI_GPI_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4dbdf76832838e9ad4b89da280bdcbca',1,'cv::CAP_PROP_XI_GPI_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4dbdf76832838e9ad4b89da280bdcbca',1,'CAP_PROP_XI_GPI_MODE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fgpi_5fselector_423',['CAP_PROP_XI_GPI_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaaaa4bcf89caf285194c200b990d94b94',1,'cv::CAP_PROP_XI_GPI_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaaaa4bcf89caf285194c200b990d94b94',1,'cv::CAP_PROP_XI_GPI_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaaaa4bcf89caf285194c200b990d94b94',1,'CAP_PROP_XI_GPI_SELECTOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5fgpo_5fmode_424',['CAP_PROP_XI_GPO_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4aadd5055b767a8ebe6be43b15b165ac',1,'cv::CAP_PROP_XI_GPO_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4aadd5055b767a8ebe6be43b15b165ac',1,'cv::CAP_PROP_XI_GPO_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4aadd5055b767a8ebe6be43b15b165ac',1,'CAP_PROP_XI_GPO_MODE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fgpo_5fselector_425',['CAP_PROP_XI_GPO_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1785d9ac27c4d678dc0afad376322a48',1,'cv::CAP_PROP_XI_GPO_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1785d9ac27c4d678dc0afad376322a48',1,'cv::CAP_PROP_XI_GPO_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1785d9ac27c4d678dc0afad376322a48',1,'CAP_PROP_XI_GPO_SELECTOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5fhdr_426',['CAP_PROP_XI_HDR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa66a91a6b9c0446067f92f552424c175',1,'cv::CAP_PROP_XI_HDR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa66a91a6b9c0446067f92f552424c175',1,'cv::CAP_PROP_XI_HDR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa66a91a6b9c0446067f92f552424c175',1,'CAP_PROP_XI_HDR(Global Namespace)']]], - ['cap_5fprop_5fxi_5fhdr_5fkneepoint_5fcount_427',['CAP_PROP_XI_HDR_KNEEPOINT_COUNT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca25f4ff6e0a75c6a4c3eb42ca69a99008',1,'cv::CAP_PROP_XI_HDR_KNEEPOINT_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca25f4ff6e0a75c6a4c3eb42ca69a99008',1,'cv::CAP_PROP_XI_HDR_KNEEPOINT_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca25f4ff6e0a75c6a4c3eb42ca69a99008',1,'CAP_PROP_XI_HDR_KNEEPOINT_COUNT(Global Namespace)']]], - ['cap_5fprop_5fxi_5fhdr_5ft1_428',['CAP_PROP_XI_HDR_T1',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad41c3fe9bf0384b4487b728ae8d71c6c',1,'cv::CAP_PROP_XI_HDR_T1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad41c3fe9bf0384b4487b728ae8d71c6c',1,'cv::CAP_PROP_XI_HDR_T1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad41c3fe9bf0384b4487b728ae8d71c6c',1,'CAP_PROP_XI_HDR_T1(Global Namespace)']]], - ['cap_5fprop_5fxi_5fhdr_5ft2_429',['CAP_PROP_XI_HDR_T2',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9462841c6f21b93462869a701078412d',1,'cv::CAP_PROP_XI_HDR_T2'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9462841c6f21b93462869a701078412d',1,'cv::CAP_PROP_XI_HDR_T2'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9462841c6f21b93462869a701078412d',1,'CAP_PROP_XI_HDR_T2(Global Namespace)']]], - ['cap_5fprop_5fxi_5fheight_430',['CAP_PROP_XI_HEIGHT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6d7d5e4b2602f9bff56564d884e08fe4',1,'cv::CAP_PROP_XI_HEIGHT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6d7d5e4b2602f9bff56564d884e08fe4',1,'cv::CAP_PROP_XI_HEIGHT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6d7d5e4b2602f9bff56564d884e08fe4',1,'CAP_PROP_XI_HEIGHT(Global Namespace)']]], - ['cap_5fprop_5fxi_5fhous_5fback_5fside_5ftemp_431',['CAP_PROP_XI_HOUS_BACK_SIDE_TEMP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac35662482264494d5d4a2d3694604454',1,'cv::CAP_PROP_XI_HOUS_BACK_SIDE_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac35662482264494d5d4a2d3694604454',1,'cv::CAP_PROP_XI_HOUS_BACK_SIDE_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac35662482264494d5d4a2d3694604454',1,'CAP_PROP_XI_HOUS_BACK_SIDE_TEMP(Global Namespace)']]], - ['cap_5fprop_5fxi_5fhous_5ftemp_432',['CAP_PROP_XI_HOUS_TEMP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa0b998a928fb6bdaa4dd1def71b5e15b',1,'cv::CAP_PROP_XI_HOUS_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa0b998a928fb6bdaa4dd1def71b5e15b',1,'cv::CAP_PROP_XI_HOUS_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa0b998a928fb6bdaa4dd1def71b5e15b',1,'CAP_PROP_XI_HOUS_TEMP(Global Namespace)']]], - ['cap_5fprop_5fxi_5fhw_5frevision_433',['CAP_PROP_XI_HW_REVISION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8dc2ca4801e0957fdf3f149c66c9f9c8',1,'cv::CAP_PROP_XI_HW_REVISION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8dc2ca4801e0957fdf3f149c66c9f9c8',1,'cv::CAP_PROP_XI_HW_REVISION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8dc2ca4801e0957fdf3f149c66c9f9c8',1,'CAP_PROP_XI_HW_REVISION(Global Namespace)']]], - ['cap_5fprop_5fxi_5fimage_5fblack_5flevel_434',['CAP_PROP_XI_IMAGE_BLACK_LEVEL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca97c3f4c0e44b9f06581578f7d03b9dbf',1,'cv::CAP_PROP_XI_IMAGE_BLACK_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca97c3f4c0e44b9f06581578f7d03b9dbf',1,'cv::CAP_PROP_XI_IMAGE_BLACK_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca97c3f4c0e44b9f06581578f7d03b9dbf',1,'CAP_PROP_XI_IMAGE_BLACK_LEVEL(Global Namespace)']]], - ['cap_5fprop_5fxi_5fimage_5fdata_5fbit_5fdepth_435',['CAP_PROP_XI_IMAGE_DATA_BIT_DEPTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3cb6414220dc96a4346dbb9820d6807c',1,'cv::CAP_PROP_XI_IMAGE_DATA_BIT_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3cb6414220dc96a4346dbb9820d6807c',1,'cv::CAP_PROP_XI_IMAGE_DATA_BIT_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3cb6414220dc96a4346dbb9820d6807c',1,'CAP_PROP_XI_IMAGE_DATA_BIT_DEPTH(Global Namespace)']]], - ['cap_5fprop_5fxi_5fimage_5fdata_5fformat_436',['CAP_PROP_XI_IMAGE_DATA_FORMAT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaace6b4af9afed47c6d39faa842607ab0',1,'cv::CAP_PROP_XI_IMAGE_DATA_FORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaace6b4af9afed47c6d39faa842607ab0',1,'cv::CAP_PROP_XI_IMAGE_DATA_FORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaace6b4af9afed47c6d39faa842607ab0',1,'CAP_PROP_XI_IMAGE_DATA_FORMAT(Global Namespace)']]], - ['cap_5fprop_5fxi_5fimage_5fdata_5fformat_5frgb32_5falpha_437',['CAP_PROP_XI_IMAGE_DATA_FORMAT_RGB32_ALPHA',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5cf923f4f06e03bd3edd5af3a44135e7',1,'cv::CAP_PROP_XI_IMAGE_DATA_FORMAT_RGB32_ALPHA'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5cf923f4f06e03bd3edd5af3a44135e7',1,'cv::CAP_PROP_XI_IMAGE_DATA_FORMAT_RGB32_ALPHA'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5cf923f4f06e03bd3edd5af3a44135e7',1,'CAP_PROP_XI_IMAGE_DATA_FORMAT_RGB32_ALPHA(Global Namespace)']]], - ['cap_5fprop_5fxi_5fimage_5fis_5fcolor_438',['CAP_PROP_XI_IMAGE_IS_COLOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3474bff058406213c00f940b7d39ca03',1,'cv::CAP_PROP_XI_IMAGE_IS_COLOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3474bff058406213c00f940b7d39ca03',1,'cv::CAP_PROP_XI_IMAGE_IS_COLOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3474bff058406213c00f940b7d39ca03',1,'CAP_PROP_XI_IMAGE_IS_COLOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5fimage_5fpayload_5fsize_439',['CAP_PROP_XI_IMAGE_PAYLOAD_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7e3cfe131842e34628f998dc87adf229',1,'cv::CAP_PROP_XI_IMAGE_PAYLOAD_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7e3cfe131842e34628f998dc87adf229',1,'cv::CAP_PROP_XI_IMAGE_PAYLOAD_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7e3cfe131842e34628f998dc87adf229',1,'CAP_PROP_XI_IMAGE_PAYLOAD_SIZE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fis_5fcooled_440',['CAP_PROP_XI_IS_COOLED',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad6a369e15415652c07377e617c31b816',1,'cv::CAP_PROP_XI_IS_COOLED'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad6a369e15415652c07377e617c31b816',1,'cv::CAP_PROP_XI_IS_COOLED'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad6a369e15415652c07377e617c31b816',1,'CAP_PROP_XI_IS_COOLED(Global Namespace)']]], - ['cap_5fprop_5fxi_5fis_5fdevice_5fexist_441',['CAP_PROP_XI_IS_DEVICE_EXIST',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5d8a3630e00a1edcb6562445ac7c97e5',1,'cv::CAP_PROP_XI_IS_DEVICE_EXIST'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5d8a3630e00a1edcb6562445ac7c97e5',1,'cv::CAP_PROP_XI_IS_DEVICE_EXIST'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5d8a3630e00a1edcb6562445ac7c97e5',1,'CAP_PROP_XI_IS_DEVICE_EXIST(Global Namespace)']]], - ['cap_5fprop_5fxi_5fkneepoint1_442',['CAP_PROP_XI_KNEEPOINT1',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacd116ed9889b08b5f617d35b74149669',1,'cv::CAP_PROP_XI_KNEEPOINT1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacd116ed9889b08b5f617d35b74149669',1,'cv::CAP_PROP_XI_KNEEPOINT1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacd116ed9889b08b5f617d35b74149669',1,'CAP_PROP_XI_KNEEPOINT1(Global Namespace)']]], - ['cap_5fprop_5fxi_5fkneepoint2_443',['CAP_PROP_XI_KNEEPOINT2',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca975d8587ffcaac63ee6d7c733b378fcd',1,'cv::CAP_PROP_XI_KNEEPOINT2'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca975d8587ffcaac63ee6d7c733b378fcd',1,'cv::CAP_PROP_XI_KNEEPOINT2'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca975d8587ffcaac63ee6d7c733b378fcd',1,'CAP_PROP_XI_KNEEPOINT2(Global Namespace)']]], - ['cap_5fprop_5fxi_5fled_5fmode_444',['CAP_PROP_XI_LED_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca722e0061b85c4785608ac5ac7a473c00',1,'cv::CAP_PROP_XI_LED_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca722e0061b85c4785608ac5ac7a473c00',1,'cv::CAP_PROP_XI_LED_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca722e0061b85c4785608ac5ac7a473c00',1,'CAP_PROP_XI_LED_MODE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fled_5fselector_445',['CAP_PROP_XI_LED_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9dbacb0484a6cceef5afd4496740e3f7',1,'cv::CAP_PROP_XI_LED_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9dbacb0484a6cceef5afd4496740e3f7',1,'cv::CAP_PROP_XI_LED_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9dbacb0484a6cceef5afd4496740e3f7',1,'CAP_PROP_XI_LED_SELECTOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5flens_5faperture_5fvalue_446',['CAP_PROP_XI_LENS_APERTURE_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca307eab1a5189dfde4c57eda926f48383',1,'cv::CAP_PROP_XI_LENS_APERTURE_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca307eab1a5189dfde4c57eda926f48383',1,'cv::CAP_PROP_XI_LENS_APERTURE_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca307eab1a5189dfde4c57eda926f48383',1,'CAP_PROP_XI_LENS_APERTURE_VALUE(Global Namespace)']]], - ['cap_5fprop_5fxi_5flens_5ffeature_447',['CAP_PROP_XI_LENS_FEATURE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca42e9e7a34d9d173ba710e8dd69205657',1,'cv::CAP_PROP_XI_LENS_FEATURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca42e9e7a34d9d173ba710e8dd69205657',1,'cv::CAP_PROP_XI_LENS_FEATURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca42e9e7a34d9d173ba710e8dd69205657',1,'CAP_PROP_XI_LENS_FEATURE(Global Namespace)']]], - ['cap_5fprop_5fxi_5flens_5ffeature_5fselector_448',['CAP_PROP_XI_LENS_FEATURE_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab28c47b9f81e7fa9d2ecccfaa3a287ea',1,'cv::CAP_PROP_XI_LENS_FEATURE_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab28c47b9f81e7fa9d2ecccfaa3a287ea',1,'cv::CAP_PROP_XI_LENS_FEATURE_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab28c47b9f81e7fa9d2ecccfaa3a287ea',1,'CAP_PROP_XI_LENS_FEATURE_SELECTOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5flens_5ffocal_5flength_449',['CAP_PROP_XI_LENS_FOCAL_LENGTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca903a9233d8a5231653a6217a8d360039',1,'cv::CAP_PROP_XI_LENS_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca903a9233d8a5231653a6217a8d360039',1,'cv::CAP_PROP_XI_LENS_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca903a9233d8a5231653a6217a8d360039',1,'CAP_PROP_XI_LENS_FOCAL_LENGTH(Global Namespace)']]], - ['cap_5fprop_5fxi_5flens_5ffocus_5fdistance_450',['CAP_PROP_XI_LENS_FOCUS_DISTANCE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7f9b49011d868c73fb578b540ddc0685',1,'cv::CAP_PROP_XI_LENS_FOCUS_DISTANCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7f9b49011d868c73fb578b540ddc0685',1,'cv::CAP_PROP_XI_LENS_FOCUS_DISTANCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7f9b49011d868c73fb578b540ddc0685',1,'CAP_PROP_XI_LENS_FOCUS_DISTANCE(Global Namespace)']]], - ['cap_5fprop_5fxi_5flens_5ffocus_5fmove_451',['CAP_PROP_XI_LENS_FOCUS_MOVE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad4cf2ae2680ee32f9acd3f080bb053ab',1,'cv::CAP_PROP_XI_LENS_FOCUS_MOVE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad4cf2ae2680ee32f9acd3f080bb053ab',1,'cv::CAP_PROP_XI_LENS_FOCUS_MOVE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad4cf2ae2680ee32f9acd3f080bb053ab',1,'CAP_PROP_XI_LENS_FOCUS_MOVE(Global Namespace)']]], - ['cap_5fprop_5fxi_5flens_5ffocus_5fmovement_5fvalue_452',['CAP_PROP_XI_LENS_FOCUS_MOVEMENT_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaed9b0f1eaade0778e19a08726370b785',1,'cv::CAP_PROP_XI_LENS_FOCUS_MOVEMENT_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaed9b0f1eaade0778e19a08726370b785',1,'cv::CAP_PROP_XI_LENS_FOCUS_MOVEMENT_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaed9b0f1eaade0778e19a08726370b785',1,'CAP_PROP_XI_LENS_FOCUS_MOVEMENT_VALUE(Global Namespace)']]], - ['cap_5fprop_5fxi_5flens_5fmode_453',['CAP_PROP_XI_LENS_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2bcfc66b47eb20fe0be9922d6faf0fa3',1,'cv::CAP_PROP_XI_LENS_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2bcfc66b47eb20fe0be9922d6faf0fa3',1,'cv::CAP_PROP_XI_LENS_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2bcfc66b47eb20fe0be9922d6faf0fa3',1,'CAP_PROP_XI_LENS_MODE(Global Namespace)']]], - ['cap_5fprop_5fxi_5flimit_5fbandwidth_454',['CAP_PROP_XI_LIMIT_BANDWIDTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3ba1662e0b303848e464d138a42a3f8d',1,'cv::CAP_PROP_XI_LIMIT_BANDWIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3ba1662e0b303848e464d138a42a3f8d',1,'cv::CAP_PROP_XI_LIMIT_BANDWIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3ba1662e0b303848e464d138a42a3f8d',1,'CAP_PROP_XI_LIMIT_BANDWIDTH(Global Namespace)']]], - ['cap_5fprop_5fxi_5flut_5fen_455',['CAP_PROP_XI_LUT_EN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa47de0c7b39fd5adc6797edbb15a2174',1,'cv::CAP_PROP_XI_LUT_EN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa47de0c7b39fd5adc6797edbb15a2174',1,'cv::CAP_PROP_XI_LUT_EN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa47de0c7b39fd5adc6797edbb15a2174',1,'CAP_PROP_XI_LUT_EN(Global Namespace)']]], - ['cap_5fprop_5fxi_5flut_5findex_456',['CAP_PROP_XI_LUT_INDEX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca12fc0fdcee31edf2a9e1a3f7fdbefacd',1,'cv::CAP_PROP_XI_LUT_INDEX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca12fc0fdcee31edf2a9e1a3f7fdbefacd',1,'cv::CAP_PROP_XI_LUT_INDEX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca12fc0fdcee31edf2a9e1a3f7fdbefacd',1,'CAP_PROP_XI_LUT_INDEX(Global Namespace)']]], - ['cap_5fprop_5fxi_5flut_5fvalue_457',['CAP_PROP_XI_LUT_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca98d369394fa4657593238af9a30fcd80',1,'cv::CAP_PROP_XI_LUT_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca98d369394fa4657593238af9a30fcd80',1,'cv::CAP_PROP_XI_LUT_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca98d369394fa4657593238af9a30fcd80',1,'CAP_PROP_XI_LUT_VALUE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fmanual_5fwb_458',['CAP_PROP_XI_MANUAL_WB',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf8a5a64e094123892b5813fff1188706',1,'cv::CAP_PROP_XI_MANUAL_WB'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf8a5a64e094123892b5813fff1188706',1,'cv::CAP_PROP_XI_MANUAL_WB'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf8a5a64e094123892b5813fff1188706',1,'CAP_PROP_XI_MANUAL_WB(Global Namespace)']]], - ['cap_5fprop_5fxi_5foffset_5fx_459',['CAP_PROP_XI_OFFSET_X',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4b7b75badbf59d821962c06cf4d025bb',1,'cv::CAP_PROP_XI_OFFSET_X'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4b7b75badbf59d821962c06cf4d025bb',1,'cv::CAP_PROP_XI_OFFSET_X'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4b7b75badbf59d821962c06cf4d025bb',1,'CAP_PROP_XI_OFFSET_X(Global Namespace)']]], - ['cap_5fprop_5fxi_5foffset_5fy_460',['CAP_PROP_XI_OFFSET_Y',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6724b0905a0bda1166a67f6ccbc70327',1,'cv::CAP_PROP_XI_OFFSET_Y'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6724b0905a0bda1166a67f6ccbc70327',1,'cv::CAP_PROP_XI_OFFSET_Y'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6724b0905a0bda1166a67f6ccbc70327',1,'CAP_PROP_XI_OFFSET_Y(Global Namespace)']]], - ['cap_5fprop_5fxi_5foutput_5fdata_5fbit_5fdepth_461',['CAP_PROP_XI_OUTPUT_DATA_BIT_DEPTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0582602575f693d8cf9f9da68f8d7e4e',1,'cv::CAP_PROP_XI_OUTPUT_DATA_BIT_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0582602575f693d8cf9f9da68f8d7e4e',1,'cv::CAP_PROP_XI_OUTPUT_DATA_BIT_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0582602575f693d8cf9f9da68f8d7e4e',1,'CAP_PROP_XI_OUTPUT_DATA_BIT_DEPTH(Global Namespace)']]], - ['cap_5fprop_5fxi_5foutput_5fdata_5fpacking_462',['CAP_PROP_XI_OUTPUT_DATA_PACKING',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9de43705d72a70642b315c0164d3f706',1,'cv::CAP_PROP_XI_OUTPUT_DATA_PACKING'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9de43705d72a70642b315c0164d3f706',1,'cv::CAP_PROP_XI_OUTPUT_DATA_PACKING'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9de43705d72a70642b315c0164d3f706',1,'CAP_PROP_XI_OUTPUT_DATA_PACKING(Global Namespace)']]], - ['cap_5fprop_5fxi_5foutput_5fdata_5fpacking_5ftype_463',['CAP_PROP_XI_OUTPUT_DATA_PACKING_TYPE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4dd38252df8993caaa6a94991c7c710a',1,'cv::CAP_PROP_XI_OUTPUT_DATA_PACKING_TYPE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4dd38252df8993caaa6a94991c7c710a',1,'cv::CAP_PROP_XI_OUTPUT_DATA_PACKING_TYPE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4dd38252df8993caaa6a94991c7c710a',1,'CAP_PROP_XI_OUTPUT_DATA_PACKING_TYPE(Global Namespace)']]], - ['cap_5fprop_5fxi_5frecent_5fframe_464',['CAP_PROP_XI_RECENT_FRAME',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab6ae274d73be763065ae6d4157c33e30',1,'cv::CAP_PROP_XI_RECENT_FRAME'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab6ae274d73be763065ae6d4157c33e30',1,'cv::CAP_PROP_XI_RECENT_FRAME'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab6ae274d73be763065ae6d4157c33e30',1,'CAP_PROP_XI_RECENT_FRAME(Global Namespace)']]], - ['cap_5fprop_5fxi_5fregion_5fmode_465',['CAP_PROP_XI_REGION_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcae147b9f0ff2b052840cfbde354db8370',1,'cv::CAP_PROP_XI_REGION_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcae147b9f0ff2b052840cfbde354db8370',1,'cv::CAP_PROP_XI_REGION_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcae147b9f0ff2b052840cfbde354db8370',1,'CAP_PROP_XI_REGION_MODE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fregion_5fselector_466',['CAP_PROP_XI_REGION_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcafa595df0cdf5b73134aa29a67ccabc74',1,'cv::CAP_PROP_XI_REGION_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcafa595df0cdf5b73134aa29a67ccabc74',1,'cv::CAP_PROP_XI_REGION_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcafa595df0cdf5b73134aa29a67ccabc74',1,'CAP_PROP_XI_REGION_SELECTOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5frow_5ffpn_5fcorrection_467',['CAP_PROP_XI_ROW_FPN_CORRECTION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca162e9f64020df1cd6d9cba4b3198061f',1,'cv::CAP_PROP_XI_ROW_FPN_CORRECTION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca162e9f64020df1cd6d9cba4b3198061f',1,'cv::CAP_PROP_XI_ROW_FPN_CORRECTION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca162e9f64020df1cd6d9cba4b3198061f',1,'CAP_PROP_XI_ROW_FPN_CORRECTION(Global Namespace)']]], - ['cap_5fprop_5fxi_5fsensor_5fboard_5ftemp_468',['CAP_PROP_XI_SENSOR_BOARD_TEMP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca94305071b134947bedeeb4c5dd59418e',1,'cv::CAP_PROP_XI_SENSOR_BOARD_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca94305071b134947bedeeb4c5dd59418e',1,'cv::CAP_PROP_XI_SENSOR_BOARD_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca94305071b134947bedeeb4c5dd59418e',1,'CAP_PROP_XI_SENSOR_BOARD_TEMP(Global Namespace)']]], - ['cap_5fprop_5fxi_5fsensor_5fclock_5ffreq_5fhz_469',['CAP_PROP_XI_SENSOR_CLOCK_FREQ_HZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa79cb01e1a0fba12586631d22896805d',1,'cv::CAP_PROP_XI_SENSOR_CLOCK_FREQ_HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa79cb01e1a0fba12586631d22896805d',1,'cv::CAP_PROP_XI_SENSOR_CLOCK_FREQ_HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa79cb01e1a0fba12586631d22896805d',1,'CAP_PROP_XI_SENSOR_CLOCK_FREQ_HZ(Global Namespace)']]], - ['cap_5fprop_5fxi_5fsensor_5fclock_5ffreq_5findex_470',['CAP_PROP_XI_SENSOR_CLOCK_FREQ_INDEX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca762ae4ae81179e7d1806ca2c09ede2a4',1,'cv::CAP_PROP_XI_SENSOR_CLOCK_FREQ_INDEX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca762ae4ae81179e7d1806ca2c09ede2a4',1,'cv::CAP_PROP_XI_SENSOR_CLOCK_FREQ_INDEX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca762ae4ae81179e7d1806ca2c09ede2a4',1,'CAP_PROP_XI_SENSOR_CLOCK_FREQ_INDEX(Global Namespace)']]], - ['cap_5fprop_5fxi_5fsensor_5fdata_5fbit_5fdepth_471',['CAP_PROP_XI_SENSOR_DATA_BIT_DEPTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca21c86de9892de694193d5d778433ce1f',1,'cv::CAP_PROP_XI_SENSOR_DATA_BIT_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca21c86de9892de694193d5d778433ce1f',1,'cv::CAP_PROP_XI_SENSOR_DATA_BIT_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca21c86de9892de694193d5d778433ce1f',1,'CAP_PROP_XI_SENSOR_DATA_BIT_DEPTH(Global Namespace)']]], - ['cap_5fprop_5fxi_5fsensor_5ffeature_5fselector_472',['CAP_PROP_XI_SENSOR_FEATURE_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa27042108d67ac05c59c09f0e8191980',1,'cv::CAP_PROP_XI_SENSOR_FEATURE_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa27042108d67ac05c59c09f0e8191980',1,'cv::CAP_PROP_XI_SENSOR_FEATURE_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa27042108d67ac05c59c09f0e8191980',1,'CAP_PROP_XI_SENSOR_FEATURE_SELECTOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5fsensor_5ffeature_5fvalue_473',['CAP_PROP_XI_SENSOR_FEATURE_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca582364263b7b374acfda85afc3b8984d',1,'cv::CAP_PROP_XI_SENSOR_FEATURE_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca582364263b7b374acfda85afc3b8984d',1,'cv::CAP_PROP_XI_SENSOR_FEATURE_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca582364263b7b374acfda85afc3b8984d',1,'CAP_PROP_XI_SENSOR_FEATURE_VALUE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fsensor_5fmode_474',['CAP_PROP_XI_SENSOR_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca74407dd885ecbf8a74358e3f01c8687e',1,'cv::CAP_PROP_XI_SENSOR_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca74407dd885ecbf8a74358e3f01c8687e',1,'cv::CAP_PROP_XI_SENSOR_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca74407dd885ecbf8a74358e3f01c8687e',1,'CAP_PROP_XI_SENSOR_MODE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fsensor_5foutput_5fchannel_5fcount_475',['CAP_PROP_XI_SENSOR_OUTPUT_CHANNEL_COUNT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca013c1c3db5462bd5e762a5c2c94a4da0',1,'cv::CAP_PROP_XI_SENSOR_OUTPUT_CHANNEL_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca013c1c3db5462bd5e762a5c2c94a4da0',1,'cv::CAP_PROP_XI_SENSOR_OUTPUT_CHANNEL_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca013c1c3db5462bd5e762a5c2c94a4da0',1,'CAP_PROP_XI_SENSOR_OUTPUT_CHANNEL_COUNT(Global Namespace)']]], - ['cap_5fprop_5fxi_5fsensor_5ftaps_476',['CAP_PROP_XI_SENSOR_TAPS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca94443f6400743b92ab0d747cccd94733',1,'cv::CAP_PROP_XI_SENSOR_TAPS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca94443f6400743b92ab0d747cccd94733',1,'cv::CAP_PROP_XI_SENSOR_TAPS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca94443f6400743b92ab0d747cccd94733',1,'CAP_PROP_XI_SENSOR_TAPS(Global Namespace)']]], - ['cap_5fprop_5fxi_5fsharpness_477',['CAP_PROP_XI_SHARPNESS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0cb34cbfab7826a77b11c241d1b68058',1,'cv::CAP_PROP_XI_SHARPNESS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0cb34cbfab7826a77b11c241d1b68058',1,'cv::CAP_PROP_XI_SHARPNESS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0cb34cbfab7826a77b11c241d1b68058',1,'CAP_PROP_XI_SHARPNESS(Global Namespace)']]], - ['cap_5fprop_5fxi_5fshutter_5ftype_478',['CAP_PROP_XI_SHUTTER_TYPE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabe84384ce558a68b1fb119c26a1fb1c7',1,'cv::CAP_PROP_XI_SHUTTER_TYPE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabe84384ce558a68b1fb119c26a1fb1c7',1,'cv::CAP_PROP_XI_SHUTTER_TYPE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabe84384ce558a68b1fb119c26a1fb1c7',1,'CAP_PROP_XI_SHUTTER_TYPE(Global Namespace)']]], - ['cap_5fprop_5fxi_5ftarget_5ftemp_479',['CAP_PROP_XI_TARGET_TEMP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7a5b70e760f454ba83133e868e8bff98',1,'cv::CAP_PROP_XI_TARGET_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7a5b70e760f454ba83133e868e8bff98',1,'cv::CAP_PROP_XI_TARGET_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7a5b70e760f454ba83133e868e8bff98',1,'CAP_PROP_XI_TARGET_TEMP(Global Namespace)']]], - ['cap_5fprop_5fxi_5ftest_5fpattern_480',['CAP_PROP_XI_TEST_PATTERN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf6e3addcd1dc86db902982df976ef398',1,'cv::CAP_PROP_XI_TEST_PATTERN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf6e3addcd1dc86db902982df976ef398',1,'cv::CAP_PROP_XI_TEST_PATTERN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf6e3addcd1dc86db902982df976ef398',1,'CAP_PROP_XI_TEST_PATTERN(Global Namespace)']]], - ['cap_5fprop_5fxi_5ftest_5fpattern_5fgenerator_5fselector_481',['CAP_PROP_XI_TEST_PATTERN_GENERATOR_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac63611cdaf894d351b953c34b93bbe27',1,'cv::CAP_PROP_XI_TEST_PATTERN_GENERATOR_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac63611cdaf894d351b953c34b93bbe27',1,'cv::CAP_PROP_XI_TEST_PATTERN_GENERATOR_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac63611cdaf894d351b953c34b93bbe27',1,'CAP_PROP_XI_TEST_PATTERN_GENERATOR_SELECTOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5ftimeout_482',['CAP_PROP_XI_TIMEOUT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6c71b080417a0fe6b182f868c4a319a7',1,'cv::CAP_PROP_XI_TIMEOUT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6c71b080417a0fe6b182f868c4a319a7',1,'cv::CAP_PROP_XI_TIMEOUT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6c71b080417a0fe6b182f868c4a319a7',1,'CAP_PROP_XI_TIMEOUT(Global Namespace)']]], - ['cap_5fprop_5fxi_5ftransport_5fpixel_5fformat_483',['CAP_PROP_XI_TRANSPORT_PIXEL_FORMAT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab45acea64fe23cb73657b4b42d443a1b',1,'cv::CAP_PROP_XI_TRANSPORT_PIXEL_FORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab45acea64fe23cb73657b4b42d443a1b',1,'cv::CAP_PROP_XI_TRANSPORT_PIXEL_FORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab45acea64fe23cb73657b4b42d443a1b',1,'CAP_PROP_XI_TRANSPORT_PIXEL_FORMAT(Global Namespace)']]], - ['cap_5fprop_5fxi_5ftrg_5fdelay_484',['CAP_PROP_XI_TRG_DELAY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5ed0495b88a2983f8be36e17c63c51fc',1,'cv::CAP_PROP_XI_TRG_DELAY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5ed0495b88a2983f8be36e17c63c51fc',1,'cv::CAP_PROP_XI_TRG_DELAY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5ed0495b88a2983f8be36e17c63c51fc',1,'CAP_PROP_XI_TRG_DELAY(Global Namespace)']]], - ['cap_5fprop_5fxi_5ftrg_5fselector_485',['CAP_PROP_XI_TRG_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca28611dcbbd5efd0c9fcfc03180ff13e6',1,'cv::CAP_PROP_XI_TRG_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca28611dcbbd5efd0c9fcfc03180ff13e6',1,'cv::CAP_PROP_XI_TRG_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca28611dcbbd5efd0c9fcfc03180ff13e6',1,'CAP_PROP_XI_TRG_SELECTOR(Global Namespace)']]], - ['cap_5fprop_5fxi_5ftrg_5fsoftware_486',['CAP_PROP_XI_TRG_SOFTWARE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa008a158bb86a33056b5cf20300b70fc',1,'cv::CAP_PROP_XI_TRG_SOFTWARE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa008a158bb86a33056b5cf20300b70fc',1,'cv::CAP_PROP_XI_TRG_SOFTWARE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa008a158bb86a33056b5cf20300b70fc',1,'CAP_PROP_XI_TRG_SOFTWARE(Global Namespace)']]], - ['cap_5fprop_5fxi_5ftrg_5fsource_487',['CAP_PROP_XI_TRG_SOURCE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa523371bc36e5e200dc8948a97a34bc9',1,'cv::CAP_PROP_XI_TRG_SOURCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa523371bc36e5e200dc8948a97a34bc9',1,'cv::CAP_PROP_XI_TRG_SOURCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa523371bc36e5e200dc8948a97a34bc9',1,'CAP_PROP_XI_TRG_SOURCE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fts_5frst_5fmode_488',['CAP_PROP_XI_TS_RST_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf1e0231c56b7d5ccb9b7d0dece3cd2f2',1,'cv::CAP_PROP_XI_TS_RST_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf1e0231c56b7d5ccb9b7d0dece3cd2f2',1,'cv::CAP_PROP_XI_TS_RST_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf1e0231c56b7d5ccb9b7d0dece3cd2f2',1,'CAP_PROP_XI_TS_RST_MODE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fts_5frst_5fsource_489',['CAP_PROP_XI_TS_RST_SOURCE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca95df1de33780fe933834b6286c5b6696',1,'cv::CAP_PROP_XI_TS_RST_SOURCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca95df1de33780fe933834b6286c5b6696',1,'cv::CAP_PROP_XI_TS_RST_SOURCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca95df1de33780fe933834b6286c5b6696',1,'CAP_PROP_XI_TS_RST_SOURCE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fused_5fffs_5fsize_490',['CAP_PROP_XI_USED_FFS_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac06438499f168922ffb7ff0a6d4565de',1,'cv::CAP_PROP_XI_USED_FFS_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac06438499f168922ffb7ff0a6d4565de',1,'cv::CAP_PROP_XI_USED_FFS_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac06438499f168922ffb7ff0a6d4565de',1,'CAP_PROP_XI_USED_FFS_SIZE(Global Namespace)']]], - ['cap_5fprop_5fxi_5fwb_5fkb_491',['CAP_PROP_XI_WB_KB',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca85591ebfaf9e08ac3298ffbddb4a6eb0',1,'cv::CAP_PROP_XI_WB_KB'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca85591ebfaf9e08ac3298ffbddb4a6eb0',1,'cv::CAP_PROP_XI_WB_KB'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca85591ebfaf9e08ac3298ffbddb4a6eb0',1,'CAP_PROP_XI_WB_KB(Global Namespace)']]], - ['cap_5fprop_5fxi_5fwb_5fkg_492',['CAP_PROP_XI_WB_KG',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca01849a14d6761cea0075d713ed1b13c3',1,'cv::CAP_PROP_XI_WB_KG'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca01849a14d6761cea0075d713ed1b13c3',1,'cv::CAP_PROP_XI_WB_KG'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca01849a14d6761cea0075d713ed1b13c3',1,'CAP_PROP_XI_WB_KG(Global Namespace)']]], - ['cap_5fprop_5fxi_5fwb_5fkr_493',['CAP_PROP_XI_WB_KR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8501e38cd113a72c31555a8fb378b8c8',1,'cv::CAP_PROP_XI_WB_KR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8501e38cd113a72c31555a8fb378b8c8',1,'cv::CAP_PROP_XI_WB_KR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8501e38cd113a72c31555a8fb378b8c8',1,'CAP_PROP_XI_WB_KR(Global Namespace)']]], - ['cap_5fprop_5fxi_5fwidth_494',['CAP_PROP_XI_WIDTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5f993678826ae1397c77d05853e9ac47',1,'cv::CAP_PROP_XI_WIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5f993678826ae1397c77d05853e9ac47',1,'cv::CAP_PROP_XI_WIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5f993678826ae1397c77d05853e9ac47',1,'CAP_PROP_XI_WIDTH(Global Namespace)']]], - ['cap_5fprop_5fzoom_495',['CAP_PROP_ZOOM',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da73f3ec06cf4f9aca1ab7f3b52260fd5e',1,'cv::CAP_PROP_ZOOM'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da73f3ec06cf4f9aca1ab7f3b52260fd5e',1,'CAP_PROP_ZOOM(Global Namespace)']]], - ['cap_5fpvapi_496',['CAP_PVAPI',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daea3f59a31f396298b5b3531c23391e49',1,'cv::CAP_PVAPI'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daea3f59a31f396298b5b3531c23391e49',1,'CAP_PVAPI(Global Namespace)']]], - ['cap_5fpvapi_5fdecimation_5f2outof16_497',['CAP_PVAPI_DECIMATION_2OUTOF16',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a93abac526319d5b0d39d89bce5508095',1,'cv::CAP_PVAPI_DECIMATION_2OUTOF16'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a93abac526319d5b0d39d89bce5508095',1,'cv::CAP_PVAPI_DECIMATION_2OUTOF16'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a93abac526319d5b0d39d89bce5508095',1,'CAP_PVAPI_DECIMATION_2OUTOF16(Global Namespace)']]], - ['cap_5fpvapi_5fdecimation_5f2outof4_498',['CAP_PVAPI_DECIMATION_2OUTOF4',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a65c059a6dfc8b709bc9bb33eb057e865',1,'cv::CAP_PVAPI_DECIMATION_2OUTOF4'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a65c059a6dfc8b709bc9bb33eb057e865',1,'cv::CAP_PVAPI_DECIMATION_2OUTOF4'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a65c059a6dfc8b709bc9bb33eb057e865',1,'CAP_PVAPI_DECIMATION_2OUTOF4(Global Namespace)']]], - ['cap_5fpvapi_5fdecimation_5f2outof8_499',['CAP_PVAPI_DECIMATION_2OUTOF8',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7aac6400fa67e4237c2bbe26fefa0c552d',1,'cv::CAP_PVAPI_DECIMATION_2OUTOF8'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7aac6400fa67e4237c2bbe26fefa0c552d',1,'cv::CAP_PVAPI_DECIMATION_2OUTOF8'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7aac6400fa67e4237c2bbe26fefa0c552d',1,'CAP_PVAPI_DECIMATION_2OUTOF8(Global Namespace)']]], - ['cap_5fpvapi_5fdecimation_5foff_500',['CAP_PVAPI_DECIMATION_OFF',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a77557674b55270997bb64557becdcae4',1,'cv::CAP_PVAPI_DECIMATION_OFF'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a77557674b55270997bb64557becdcae4',1,'cv::CAP_PVAPI_DECIMATION_OFF'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a77557674b55270997bb64557becdcae4',1,'CAP_PVAPI_DECIMATION_OFF(Global Namespace)']]], - ['cap_5fpvapi_5ffstrigmode_5ffixedrate_501',['CAP_PVAPI_FSTRIGMODE_FIXEDRATE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150a393224986d05449896f3f1614865ac37',1,'cv::CAP_PVAPI_FSTRIGMODE_FIXEDRATE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150a393224986d05449896f3f1614865ac37',1,'cv::CAP_PVAPI_FSTRIGMODE_FIXEDRATE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150a393224986d05449896f3f1614865ac37',1,'CAP_PVAPI_FSTRIGMODE_FIXEDRATE(Global Namespace)']]], - ['cap_5fpvapi_5ffstrigmode_5ffreerun_502',['CAP_PVAPI_FSTRIGMODE_FREERUN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150ad149577e9f1a26d0b9ab7cc38ea66e25',1,'cv::CAP_PVAPI_FSTRIGMODE_FREERUN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150ad149577e9f1a26d0b9ab7cc38ea66e25',1,'cv::CAP_PVAPI_FSTRIGMODE_FREERUN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150ad149577e9f1a26d0b9ab7cc38ea66e25',1,'CAP_PVAPI_FSTRIGMODE_FREERUN(Global Namespace)']]], - ['cap_5fpvapi_5ffstrigmode_5fsoftware_503',['CAP_PVAPI_FSTRIGMODE_SOFTWARE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150aadfb77546571860e37e5adf9ea661a72',1,'cv::CAP_PVAPI_FSTRIGMODE_SOFTWARE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150aadfb77546571860e37e5adf9ea661a72',1,'cv::CAP_PVAPI_FSTRIGMODE_SOFTWARE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150aadfb77546571860e37e5adf9ea661a72',1,'CAP_PVAPI_FSTRIGMODE_SOFTWARE(Global Namespace)']]], - ['cap_5fpvapi_5ffstrigmode_5fsyncin1_504',['CAP_PVAPI_FSTRIGMODE_SYNCIN1',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150af199d5c684aa54a3d37a8a5d7ddfc3c3',1,'cv::CAP_PVAPI_FSTRIGMODE_SYNCIN1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150af199d5c684aa54a3d37a8a5d7ddfc3c3',1,'cv::CAP_PVAPI_FSTRIGMODE_SYNCIN1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150af199d5c684aa54a3d37a8a5d7ddfc3c3',1,'CAP_PVAPI_FSTRIGMODE_SYNCIN1(Global Namespace)']]], - ['cap_5fpvapi_5ffstrigmode_5fsyncin2_505',['CAP_PVAPI_FSTRIGMODE_SYNCIN2',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150aca95ce56d9dea6f7addc0f578f0e960b',1,'cv::CAP_PVAPI_FSTRIGMODE_SYNCIN2'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150aca95ce56d9dea6f7addc0f578f0e960b',1,'cv::CAP_PVAPI_FSTRIGMODE_SYNCIN2'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150aca95ce56d9dea6f7addc0f578f0e960b',1,'CAP_PVAPI_FSTRIGMODE_SYNCIN2(Global Namespace)']]], - ['cap_5fpvapi_5fpixelformat_5fbayer16_506',['CAP_PVAPI_PIXELFORMAT_BAYER16',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a13e3854cacaa94dd376d6742b4701051',1,'cv::CAP_PVAPI_PIXELFORMAT_BAYER16'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a13e3854cacaa94dd376d6742b4701051',1,'cv::CAP_PVAPI_PIXELFORMAT_BAYER16'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a13e3854cacaa94dd376d6742b4701051',1,'CAP_PVAPI_PIXELFORMAT_BAYER16(Global Namespace)']]], - ['cap_5fpvapi_5fpixelformat_5fbayer8_507',['CAP_PVAPI_PIXELFORMAT_BAYER8',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a14cc8991f566cbb95661a95b9d02ff5f',1,'cv::CAP_PVAPI_PIXELFORMAT_BAYER8'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a14cc8991f566cbb95661a95b9d02ff5f',1,'cv::CAP_PVAPI_PIXELFORMAT_BAYER8'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a14cc8991f566cbb95661a95b9d02ff5f',1,'CAP_PVAPI_PIXELFORMAT_BAYER8(Global Namespace)']]], - ['cap_5fpvapi_5fpixelformat_5fbgr24_508',['CAP_PVAPI_PIXELFORMAT_BGR24',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6abcecb9c33a2533abfc3b2caf6ddf10e8',1,'cv::CAP_PVAPI_PIXELFORMAT_BGR24'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6abcecb9c33a2533abfc3b2caf6ddf10e8',1,'cv::CAP_PVAPI_PIXELFORMAT_BGR24'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6abcecb9c33a2533abfc3b2caf6ddf10e8',1,'CAP_PVAPI_PIXELFORMAT_BGR24(Global Namespace)']]], - ['cap_5fpvapi_5fpixelformat_5fbgra32_509',['CAP_PVAPI_PIXELFORMAT_BGRA32',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a0fa9e749378a7e1afdce0ef93bc98139',1,'cv::CAP_PVAPI_PIXELFORMAT_BGRA32'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a0fa9e749378a7e1afdce0ef93bc98139',1,'cv::CAP_PVAPI_PIXELFORMAT_BGRA32'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a0fa9e749378a7e1afdce0ef93bc98139',1,'CAP_PVAPI_PIXELFORMAT_BGRA32(Global Namespace)']]], - ['cap_5fpvapi_5fpixelformat_5fmono16_510',['CAP_PVAPI_PIXELFORMAT_MONO16',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6aac9c9b4bfc19ee84bd9428f0cca98c9a',1,'cv::CAP_PVAPI_PIXELFORMAT_MONO16'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6aac9c9b4bfc19ee84bd9428f0cca98c9a',1,'cv::CAP_PVAPI_PIXELFORMAT_MONO16'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6aac9c9b4bfc19ee84bd9428f0cca98c9a',1,'CAP_PVAPI_PIXELFORMAT_MONO16(Global Namespace)']]], - ['cap_5fpvapi_5fpixelformat_5fmono8_511',['CAP_PVAPI_PIXELFORMAT_MONO8',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a7910aa88e73d326883f0742f760ecae1',1,'cv::CAP_PVAPI_PIXELFORMAT_MONO8'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a7910aa88e73d326883f0742f760ecae1',1,'cv::CAP_PVAPI_PIXELFORMAT_MONO8'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a7910aa88e73d326883f0742f760ecae1',1,'CAP_PVAPI_PIXELFORMAT_MONO8(Global Namespace)']]], - ['cap_5fpvapi_5fpixelformat_5frgb24_512',['CAP_PVAPI_PIXELFORMAT_RGB24',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6acd6f4bfde8ab0461d43616e3f2c11b31',1,'cv::CAP_PVAPI_PIXELFORMAT_RGB24'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6acd6f4bfde8ab0461d43616e3f2c11b31',1,'cv::CAP_PVAPI_PIXELFORMAT_RGB24'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6acd6f4bfde8ab0461d43616e3f2c11b31',1,'CAP_PVAPI_PIXELFORMAT_RGB24(Global Namespace)']]], - ['cap_5fpvapi_5fpixelformat_5frgba32_513',['CAP_PVAPI_PIXELFORMAT_RGBA32',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a2069a8d1441e7c7c461273cf09692803',1,'cv::CAP_PVAPI_PIXELFORMAT_RGBA32'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a2069a8d1441e7c7c461273cf09692803',1,'cv::CAP_PVAPI_PIXELFORMAT_RGBA32'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a2069a8d1441e7c7c461273cf09692803',1,'CAP_PVAPI_PIXELFORMAT_RGBA32(Global Namespace)']]], - ['cap_5fqt_514',['CAP_QT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dac06269ed54875916d93209669512c1c4',1,'cv::CAP_QT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dac06269ed54875916d93209669512c1c4',1,'CAP_QT(Global Namespace)']]], - ['cap_5frealsense_515',['CAP_REALSENSE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da7f442efc12cf9056cf4dc1597ba7fda6',1,'cv::CAP_REALSENSE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da7f442efc12cf9056cf4dc1597ba7fda6',1,'CAP_REALSENSE(Global Namespace)']]], - ['cap_5funicap_516',['CAP_UNICAP',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da44311f187ece704740c79eedcadd9856',1,'cv::CAP_UNICAP'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da44311f187ece704740c79eedcadd9856',1,'CAP_UNICAP(Global Namespace)']]], - ['cap_5fv4l_517',['CAP_V4L',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da0c5f2eb9d2d43fb3582583203160a419',1,'cv::CAP_V4L'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da0c5f2eb9d2d43fb3582583203160a419',1,'CAP_V4L(Global Namespace)']]], - ['cap_5fv4l2_518',['CAP_V4L2',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da78d2234242b9be9c53196be7c2bb2537',1,'cv::CAP_V4L2'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da78d2234242b9be9c53196be7c2bb2537',1,'CAP_V4L2(Global Namespace)']]], - ['cap_5fvfw_519',['CAP_VFW',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da5290a0c5005edf1c5715a0c8e637b861',1,'cv::CAP_VFW'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da5290a0c5005edf1c5715a0c8e637b861',1,'CAP_VFW(Global Namespace)']]], - ['cap_5fwinrt_520',['CAP_WINRT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da92175615b64b63f7fe170e1fe8eabeea',1,'cv::CAP_WINRT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da92175615b64b63f7fe170e1fe8eabeea',1,'CAP_WINRT(Global Namespace)']]], - ['cap_5fwinrt_2ehpp_521',['cap_winrt.hpp',['https://docs.opencv.org/4.2.0/d7/d64/cap__winrt_8hpp.html',1,'']]], - ['cap_5fxiapi_522',['CAP_XIAPI',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da09a7f09167711d60cd98bb779154374b',1,'cv::CAP_XIAPI'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da09a7f09167711d60cd98bb779154374b',1,'CAP_XIAPI(Global Namespace)']]], - ['cap_5fxine_523',['CAP_XINE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da5cc03d4fed01f175de71b3fd228a1ac3',1,'cv::CAP_XINE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da5cc03d4fed01f175de71b3fd228a1ac3',1,'CAP_XINE(Global Namespace)']]], - ['capacity_524',['capacity',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a7875f908db08e3d0940ab928eb160268',1,'__gnu_cxx::__versa_string::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'__gnu_debug::basic_string::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< _CharT >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< _CharT, _Traits, _Allocator >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< char >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< char, char_traits< char >, _Byte_alloc >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< char_type, _Traits, _Alloc >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< value_type >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'match_results< _Bi_iter >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'std::basic_string::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'std::match_results::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'std::vector::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< __diff_type >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _CharClassT >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _CharT >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _Cmpt >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _Node *, _Nodeptr_Alloc >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _RealType >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _State< _TraitsT::char_type > >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _StringT >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< block_type, allocator_type >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< Catalog_info * >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< double >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< int >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< result_type >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< size_t >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< std::pair< _BiIter, int > >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< std::pair< _StateIdT, std::vector > >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< std::pair< _StrTransT, _StrTransT > >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< sub_match< _Bi_iter >, _Alloc >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< sub_match< _BiIter >, _Alloc >::capacity()']]], - ['capture_525',['Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'Face Detection in Video Capture'],['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'Image Processing for Video Capture']]], - ['capture_20gray_20code_20pattern_20tutorial_526',['Capture Gray code pattern tutorial',['https://docs.opencv.org/4.2.0/db/d56/tutorial_capture_graycode_pattern.html',1,'']]], - ['capture_20sinusoidal_20pattern_20tutorial_527',['Capture Sinusoidal pattern tutorial',['https://docs.opencv.org/4.2.0/d0/de8/tutorial_capture_sinusoidal_pattern.html',1,'']]], - ['capture_5fpattern_2emarkdown_528',['capture_pattern.markdown',['https://docs.opencv.org/4.2.0/d5/df3/capture__pattern_8markdown.html',1,'']]], - ['capturesession_529',['captureSession',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#adb4a93417ac810225829d95718b15187',1,'CvAbstractCamera']]], - ['capturesessionloaded_530',['captureSessionLoaded',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a0433c6ce2417ab9f6ab3bcb6bf4914e5',1,'CvAbstractCamera']]], - ['capturesinpattern_2emarkdown_531',['capturesinpattern.markdown',['https://docs.opencv.org/4.2.0/d4/d9d/capturesinpattern_8markdown.html',1,'']]], - ['capturevideopreviewlayer_532',['captureVideoPreviewLayer',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#ab2584923d445cacd3f1bf37bc917a260',1,'CvAbstractCamera']]], - ['carttopolar_533',['cartToPolar',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gac5f92f48ec32cacf5275969c33ee837d',1,'cv::cartToPolar()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga82210c7d1c1d42e616e554bf75a53480',1,'cv::cuda::cartToPolar()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga3e20a87f89b397c27a9a8bfd57ff0180',1,'cv::gapi::cartToPolar()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gac5f92f48ec32cacf5275969c33ee837d',1,'cartToPolar(InputArray x, InputArray y, OutputArray magnitude, OutputArray angle, bool angleInDegrees=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga3e20a87f89b397c27a9a8bfd57ff0180',1,'cartToPolar(const GMat &x, const GMat &y, bool angleInDegrees=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga82210c7d1c1d42e616e554bf75a53480',1,'cartToPolar(InputArray x, InputArray y, OutputArray magnitude, OutputArray angle, bool angleInDegrees=false, Stream &stream=Stream::Null())(Global Namespace)']]], - ['cascade_534',['cascade',['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html#a67f72702a442dc214313897a8818a39e',1,'cv::face::CParams']]], - ['cascade_20classifier_535',['Cascade Classifier',['https://docs.opencv.org/4.2.0/db/d28/tutorial_cascade_classifier.html',1,'']]], - ['cascade_20classifier_20training_536',['Cascade Classifier Training',['https://docs.opencv.org/4.2.0/dc/d88/tutorial_traincascade.html',1,'']]], - ['cascade_5fclassifier_2emarkdown_537',['cascade_classifier.markdown',['https://docs.opencv.org/4.2.0/d0/d98/cascade__classifier_8markdown.html',1,'']]], - ['cascade_5fdepth_538',['cascade_depth',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#af9e428c04035a663477ff6e72f15eadc',1,'cv::face::FacemarkKazemi::Params']]], - ['cascade_5fdo_5fcanny_5fpruning_539',['CASCADE_DO_CANNY_PRUNING',['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a04a050084d81a4a05abe92b7fc9ef210',1,'cv::CASCADE_DO_CANNY_PRUNING'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a04a050084d81a4a05abe92b7fc9ef210',1,'CASCADE_DO_CANNY_PRUNING(Global Namespace)']]], - ['cascade_5fdo_5frough_5fsearch_540',['CASCADE_DO_ROUGH_SEARCH',['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a54f9abc96125f942117c847bc8fa9b83',1,'cv::CASCADE_DO_ROUGH_SEARCH'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a54f9abc96125f942117c847bc8fa9b83',1,'CASCADE_DO_ROUGH_SEARCH(Global Namespace)']]], - ['cascade_5fface_541',['cascade_face',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a1ec6e46789b622a7b05c3f9df0053328',1,'cv::face::FacemarkLBF::Params']]], - ['cascade_5ffind_5fbiggest_5fobject_542',['CASCADE_FIND_BIGGEST_OBJECT',['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a3ecc6a38e196bd80afb57ac7b116c7fc',1,'cv::CASCADE_FIND_BIGGEST_OBJECT'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a3ecc6a38e196bd80afb57ac7b116c7fc',1,'CASCADE_FIND_BIGGEST_OBJECT(Global Namespace)']]], - ['cascade_5fscale_5fimage_543',['CASCADE_SCALE_IMAGE',['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a1d35c5234686c05c075d224efc91d673',1,'cv::CASCADE_SCALE_IMAGE'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a1d35c5234686c05c075d224efc91d673',1,'CASCADE_SCALE_IMAGE(Global Namespace)']]], - ['cascadeclassifier_544',['CascadeClassifier',['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html',1,'cv::CascadeClassifier'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html',1,'cv::cuda::CascadeClassifier'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#ab3e572643114c43b21074df48c565a27',1,'cv::CascadeClassifier::CascadeClassifier()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a6d01a748b103f0cd6bd2a20037ae8731',1,'cv::CascadeClassifier::CascadeClassifier(const String &filename)']]], - ['cascadefortracking_545',['cascadeForTracking',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a139b62b2435087f6ef6527b75f69a751',1,'cv::DetectionBasedTracker']]], - ['cascades_546',['Cascades',['https://docs.opencv.org/4.2.0/d7/d8b/tutorial_py_face_detection.html',1,'Face Detection using Haar Cascades'],['https://docs.opencv.org/4.2.0/d2/d99/tutorial_js_face_detection.html',1,'Face Detection using Haar Cascades']]], - ['cassert_547',['cassert',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00185.html',1,'']]], - ['cast_548',['cast',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a0e9ce77d38d4f5c4060a7b2df93df42a',1,'cv::Affine3::cast()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a0e9ce77d38d4f5c4060a7b2df93df42a',1,'Affine3< float >::cast()'],['https://docs.opencv.org/4.2.0/d2/d31/structcv_1_1cudev_1_1vec__math__detail_1_1SatCastHelper_3_011_00_01VecD_01_4.html#a96a5b2c56618ae4fc9d68d9bc1bd4a88',1,'cv::cudev::vec_math_detail::SatCastHelper< 1, VecD >::cast()'],['https://docs.opencv.org/4.2.0/dc/dbc/structcv_1_1cudev_1_1vec__math__detail_1_1SatCastHelper_3_012_00_01VecD_01_4.html#a8ff7715f17712bb9b22c42246d75c5be',1,'cv::cudev::vec_math_detail::SatCastHelper< 2, VecD >::cast()'],['https://docs.opencv.org/4.2.0/d8/dbe/structcv_1_1cudev_1_1vec__math__detail_1_1SatCastHelper_3_013_00_01VecD_01_4.html#a732bd39cf56650c63cc4bb82f13e839d',1,'cv::cudev::vec_math_detail::SatCastHelper< 3, VecD >::cast()'],['https://docs.opencv.org/4.2.0/df/d18/structcv_1_1cudev_1_1vec__math__detail_1_1SatCastHelper_3_014_00_01VecD_01_4.html#a10e25561501945f78fca30f4738cfd16',1,'cv::cudev::vec_math_detail::SatCastHelper< 4, VecD >::cast()'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#a2a5fefa22cb5b69971c3eff8854fe6c7',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a5b867bc4a02f78d7feaf45eaaa6f5484',1,'Eigen::AlignedBox::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a566d3231bd0e209469ab8ee37aada6a4',1,'Eigen::AngleAxis::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#acfeb7c6af0d9cedb04a4a4268948f015',1,'Eigen::Hyperplane::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#acd906e5340b05a41e098496aa861e5a5',1,'Eigen::ParametrizedLine::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a951d627764be63ca1e8c2c4c7315e43f',1,'Eigen::QuaternionBase::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a951d627764be63ca1e8c2c4c7315e43f',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a951d627764be63ca1e8c2c4c7315e43f',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a951d627764be63ca1e8c2c4c7315e43f',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a66445e2faf7f98d535fd5a8bf0a974e1',1,'Eigen::Rotation2D::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a86a66867b2a9ee0c9c4e920baf2bdacd',1,'Eigen::Transform::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a6dda00ac348f3061cd501f2822d0e534',1,'Eigen::Translation::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#af93a9ee1d6efc102b65a197f3ea3d4cd',1,'Eigen::UniformScaling::cast()'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cast() const(Global Namespace)']]], - ['cast_2eh_549',['cast.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01037.html',1,'']]], - ['cast_5ffp16_550',['cast_fp16',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d1fb7894d813ebf16e94899bc6b2f6a',1,'cv::cudev::cast_fp16()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d1fb7894d813ebf16e94899bc6b2f6a',1,'cast_fp16()(Global Namespace)']]], - ['cast_5ffp16_3c_20float_2c_20short_20_3e_551',['cast_fp16< float, short >',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99a700f4bbd52181d43bfdc6b5a3ebe5',1,'cv::cudev::cast_fp16< float, short >()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99a700f4bbd52181d43bfdc6b5a3ebe5',1,'cast_fp16< float, short >()(Global Namespace)']]], - ['cast_5ffp16_3c_20short_2c_20float_20_3e_552',['cast_fp16< short, float >',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dcd5add77bb51d0047da95199df56f8',1,'cv::cudev::cast_fp16< short, float >()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dcd5add77bb51d0047da95199df56f8',1,'cast_fp16< short, float >(short v)(Global Namespace)']]], - ['catalog_20of_20coefficient_20wise_20math_20functions_553',['Catalog of coefficient-wise math functions',['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'']]], - ['catalogue_20of_20dense_20decompositions_554',['Catalogue of dense decompositions',['https://eigen.tuxfamily.org/dox/group__TopicLinearAlgebraDecompositions.html',1,'']]], - ['categorization_555',['Object Categorization',['https://docs.opencv.org/4.2.0/de/d24/group__features2d__category.html',1,'']]], - ['category_556',['category',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a969b15053ff1b296935ea2dff07afad5',1,'std::locale']]], - ['cauchy_5fdistribution_557',['cauchy_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html',1,'std']]], - ['causing_20optical_20illusions_558',['Processing images causing optical illusions',['https://docs.opencv.org/4.2.0/d7/d8f/tutorial_bioinspired_retina_illusion.html',1,'']]], - ['cbefore_5fbegin_559',['cbefore_begin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a8e747964c0b29e83f50020110f4b1d72',1,'std::forward_list']]], - ['cbegin_560',['cbegin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#acd9303d9a1eea900367172706bbea0fc',1,'__gnu_cxx::__versa_string::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< _CharT >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< _CharT, _Traits, _Allocator >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< char >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< char, char_traits< char >, _Byte_alloc >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< char_type, _Traits, _Alloc >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< value_type >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a289af3aac006b9faa969fbdf090f8202',1,'deque< _StateSeqT >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aac9c52d90a45482d052dbb4b2040b6da',1,'list< __inp, __rebind_inp >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a785d55284f022fd44b5cb192aaaac850',1,'match_results< _Bi_iter >::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a785d55284f022fd44b5cb192aaaac850',1,'match_results< _Bi_iter >::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'std::basic_string::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a289af3aac006b9faa969fbdf090f8202',1,'std::deque::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ace31decae76d75133e08418f392a78b3',1,'std::forward_list::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aac9c52d90a45482d052dbb4b2040b6da',1,'std::list::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#af11167910bc728cbeb7997b7e8bd8326',1,'std::map::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a785d55284f022fd44b5cb192aaaac850',1,'std::match_results::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a749c6f97a0d9ecc3fa8810bc2452291d',1,'std::multimap::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a47de6fecee69e70e8e20f69e31774708',1,'std::multiset::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a39e7d303fb234db62a1faa6df63f4604',1,'std::set::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af9610ba94f6f17e7af50d7280638fa17',1,'std::unordered_map::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a326f910adabc220031b93dc6b472b913',1,'std::unordered_map::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af9610ba94f6f17e7af50d7280638fa17',1,'std::unordered_map::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a326f910adabc220031b93dc6b472b913',1,'std::unordered_map::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ae1c99977950ad720b2b10f6daf6c31ab',1,'std::unordered_multimap::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ad4f2132ee625dc5b3a48d28a495d552f',1,'std::unordered_multimap::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ae1c99977950ad720b2b10f6daf6c31ab',1,'std::unordered_multimap::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ad4f2132ee625dc5b3a48d28a495d552f',1,'std::unordered_multimap::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a8fefcc1326d2d85a00bf958f7086d4a1',1,'std::unordered_multiset::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af211aacc4102c0ceb0814dd6c518e8ed',1,'std::unordered_multiset::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af211aacc4102c0ceb0814dd6c518e8ed',1,'std::unordered_multiset::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a4bc73af25660f155f196c73298073f27',1,'std::unordered_set::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a30a15b1c31e75c9cfd56a4b3f24fe1ce',1,'std::unordered_set::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a30a15b1c31e75c9cfd56a4b3f24fe1ce',1,'std::unordered_set::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'std::vector::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af9610ba94f6f17e7af50d7280638fa17',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a326f910adabc220031b93dc6b472b913',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af9610ba94f6f17e7af50d7280638fa17',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a326f910adabc220031b93dc6b472b913',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< __diff_type >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _CharClassT >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _CharT >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _Cmpt >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _Node *, _Nodeptr_Alloc >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _RealType >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _State< _TraitsT::char_type > >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _StringT >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< block_type, allocator_type >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< Catalog_info * >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< double >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< int >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< result_type >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< size_t >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< std::pair< _BiIter, int > >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< std::pair< _StateIdT, std::vector > >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< std::pair< _StrTransT, _StrTransT > >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< sub_match< _Bi_iter >, _Alloc >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< sub_match< _BiIter >, _Alloc >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae9a3dfd9b826ba3103de0128576fb15b',1,'Eigen::DenseBase::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae9a3dfd9b826ba3103de0128576fb15b',1,'DenseBase< ArrayWrapper< ExpressionType > >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae9a3dfd9b826ba3103de0128576fb15b',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae9a3dfd9b826ba3103de0128576fb15b',1,'DenseBase< Solve< Decomposition, RhsType > >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'Eigen::VectorwiseOp::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const Derived, Horizontal >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const Derived, Vertical >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::cbegin()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ae508c13e3ad6ce445bcaf24a2bc7d039.html#ae508c13e3ad6ce445bcaf24a2bc7d039',1,'nlohmann::basic_json::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac10e18b5c09f39bc07430a9d47e584a5',1,'std::cbegin()']]], - ['cbor_5ftag_5fhandler_5ft_561',['cbor_tag_handler_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a54951d14f0dd10cc3cfdaa24f8bfd15c.html#a54951d14f0dd10cc3cfdaa24f8bfd15c',1,'nlohmann::basic_json']]], - ['cbrt_562',['cbrt',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac8f04998be778e95f591ae789e7d6578',1,'cv::cbrt()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac8f04998be778e95f591ae789e7d6578',1,'cbrt()(Global Namespace)']]], - ['cc_563',['cc',['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a028c1d86a8275c82b089510768f853bd',1,'cv::CascadeClassifier']]], - ['cc_5fhash_5fmax_5fcollision_5fcheck_5fresize_5ftrigger_564',['cc_hash_max_collision_check_resize_trigger',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger< External_Load_Access, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a3570f81e8bebfa7c217839b679c1692c',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::cc_hash_max_collision_check_resize_trigger()']]], - ['cc_5fhash_5fmax_5fcollision_5fcheck_5fresize_5ftrigger_5fimp_2ehpp_565',['cc_hash_max_collision_check_resize_trigger_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01400.html',1,'']]], - ['cc_5fhash_5ftable_566',['cc_hash_table',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html',1,'__gnu_pbds::cc_hash_table< class, class, class, class, class, class, Store_Hash, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a5bb84ecde74cb41964822f5d7cce74e1',1,'__gnu_pbds::cc_hash_table::cc_hash_table()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#ae82fe7fcb8c0975de60e6fa15ce95085',1,'__gnu_pbds::cc_hash_table::cc_hash_table(const hash_fn &h)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a27bdb924e2946488ec465fcacde15e21',1,'__gnu_pbds::cc_hash_table::cc_hash_table(const hash_fn &h, const eq_fn &e)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a2f83d8a3065813574b512ebbf8437447',1,'__gnu_pbds::cc_hash_table::cc_hash_table(const hash_fn &h, const eq_fn &e, const comb_hash_fn &ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#af141c65bc358d5c20b19adfe317ad7ac',1,'__gnu_pbds::cc_hash_table::cc_hash_table(const hash_fn &h, const eq_fn &e, const comb_hash_fn &ch, const resize_policy &rp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a70bcd64a9cb68398c169151c36365be9',1,'__gnu_pbds::cc_hash_table::cc_hash_table(It first, It last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a406cabdd8523a7b910875ce4ecce1cbc',1,'__gnu_pbds::cc_hash_table::cc_hash_table(It first, It last, const hash_fn &h)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a824df817359f701b3d157ed8638d4528',1,'__gnu_pbds::cc_hash_table::cc_hash_table(It first, It last, const hash_fn &h, const eq_fn &e)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a1bca4b04926462c9f409b902ebb0b397',1,'__gnu_pbds::cc_hash_table::cc_hash_table(It first, It last, const hash_fn &h, const eq_fn &e, const comb_hash_fn &ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a2ffb9ad5d7b0bdde4f5e079ed3c0a6a5',1,'__gnu_pbds::cc_hash_table::cc_hash_table(It first, It last, const hash_fn &h, const eq_fn &e, const comb_hash_fn &ch, const resize_policy &rp)']]], - ['cc_5fhash_5ftable_5fmap_5f_2fconstructor_5fdestructor_5ffn_5fimps_2ehpp_567',['cc_hash_table_map_/constructor_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16661.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2fconstructor_5fdestructor_5fno_5fstore_5fhash_5ffn_5fimps_2ehpp_568',['cc_hash_table_map_/constructor_destructor_no_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16670.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2fconstructor_5fdestructor_5fstore_5fhash_5ffn_5fimps_2ehpp_569',['cc_hash_table_map_/constructor_destructor_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16676.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2fdebug_5ffn_5fimps_2ehpp_570',['cc_hash_table_map_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16757.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2fdebug_5fno_5fstore_5fhash_5ffn_5fimps_2ehpp_571',['cc_hash_table_map_/debug_no_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16790.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2fdebug_5fstore_5fhash_5ffn_5fimps_2ehpp_572',['cc_hash_table_map_/debug_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16796.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2ferase_5ffn_5fimps_2ehpp_573',['cc_hash_table_map_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16820.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2ferase_5fno_5fstore_5fhash_5ffn_5fimps_2ehpp_574',['cc_hash_table_map_/erase_no_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16853.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2ferase_5fstore_5fhash_5ffn_5fimps_2ehpp_575',['cc_hash_table_map_/erase_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16859.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2ffind_5ffn_5fimps_2ehpp_576',['cc_hash_table_map_/find_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16874.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2ffind_5fstore_5fhash_5ffn_5fimps_2ehpp_577',['cc_hash_table_map_/find_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16898.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2finfo_5ffn_5fimps_2ehpp_578',['cc_hash_table_map_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16955.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2finsert_5ffn_5fimps_2ehpp_579',['cc_hash_table_map_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16988.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2finsert_5fno_5fstore_5fhash_5ffn_5fimps_2ehpp_580',['cc_hash_table_map_/insert_no_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17018.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2finsert_5fstore_5fhash_5ffn_5fimps_2ehpp_581',['cc_hash_table_map_/insert_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17024.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2fiterators_5ffn_5fimps_2ehpp_582',['cc_hash_table_map_/iterators_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17042.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2fpolicy_5faccess_5ffn_5fimps_2ehpp_583',['cc_hash_table_map_/policy_access_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17150.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2fresize_5ffn_5fimps_2ehpp_584',['cc_hash_table_map_/resize_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17189.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2fresize_5fno_5fstore_5fhash_5ffn_5fimps_2ehpp_585',['cc_hash_table_map_/resize_no_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17195.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2fresize_5fstore_5fhash_5ffn_5fimps_2ehpp_586',['cc_hash_table_map_/resize_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17201.html',1,'']]], - ['cc_5fhash_5ftable_5fmap_5f_2ftrace_5ffn_5fimps_2ehpp_587',['cc_hash_table_map_/trace_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17285.html',1,'']]], - ['cc_5fhash_5ftag_588',['cc_hash_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11227.html',1,'__gnu_pbds']]], - ['cc_5fht_5fmap_589',['cc_ht_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11671.html',1,'__gnu_pbds::detail']]], - ['cc_5fht_5fmap_5f_2ehpp_590',['cc_ht_map_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01241.html',1,'']]], - ['cc_5fstat_5farea_591',['CC_STAT_AREA',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a49573cd2ef1510fd96052d94feaac901',1,'cv::CC_STAT_AREA'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a49573cd2ef1510fd96052d94feaac901',1,'CC_STAT_AREA(Global Namespace)']]], - ['cc_5fstat_5fheight_592',['CC_STAT_HEIGHT',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a9b2a516b764fd4a35c8513ce0bc9c570',1,'cv::CC_STAT_HEIGHT'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a9b2a516b764fd4a35c8513ce0bc9c570',1,'CC_STAT_HEIGHT(Global Namespace)']]], - ['cc_5fstat_5fleft_593',['CC_STAT_LEFT',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a04bf79427482a254e98c546080c89479',1,'cv::CC_STAT_LEFT'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a04bf79427482a254e98c546080c89479',1,'CC_STAT_LEFT(Global Namespace)']]], - ['cc_5fstat_5ftop_594',['CC_STAT_TOP',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a5dcf5ad1fb02f810023ce2d4148abb09',1,'cv::CC_STAT_TOP'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a5dcf5ad1fb02f810023ce2d4148abb09',1,'CC_STAT_TOP(Global Namespace)']]], - ['cc_5fstat_5fwidth_595',['CC_STAT_WIDTH',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5af747c3b07668e91a316945a70adcef59',1,'cv::CC_STAT_WIDTH'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5af747c3b07668e91a316945a70adcef59',1,'CC_STAT_WIDTH(Global Namespace)']]], - ['ccalib_2ehpp_596',['ccalib.hpp',['https://docs.opencv.org/4.2.0/d6/d01/ccalib_8hpp.html',1,'']]], - ['ccl_5fdefault_597',['CCL_DEFAULT',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga5ed7784614678adccb699c70fb841075abd210ad49e33f19f2cb8c090c11f7a4c',1,'cv::CCL_DEFAULT'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga5ed7784614678adccb699c70fb841075abd210ad49e33f19f2cb8c090c11f7a4c',1,'CCL_DEFAULT(Global Namespace)']]], - ['ccl_5fgrana_598',['CCL_GRANA',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga5ed7784614678adccb699c70fb841075a49eccb403b410391d5ff9048d30596f5',1,'cv::CCL_GRANA'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga5ed7784614678adccb699c70fb841075a49eccb403b410391d5ff9048d30596f5',1,'CCL_GRANA(Global Namespace)']]], - ['ccl_5fwu_599',['CCL_WU',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga5ed7784614678adccb699c70fb841075a612680db0d08d338109a6cd758417b66',1,'cv::CCL_WU'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga5ed7784614678adccb699c70fb841075a612680db0d08d338109a6cd758417b66',1,'CCL_WU(Global Namespace)']]], - ['ccomplex_600',['ccomplex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00188.html',1,'']]], - ['cctype_601',['cctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00191.html',1,'']]], - ['cdt_602',['Using OpenCV with Eclipse (plugin CDT)',['https://docs.opencv.org/4.2.0/d7/d16/tutorial_linux_eclipse.html',1,'']]], - ['ceil_603',['ceil',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#aa73e38be0689a463ae14141b9cf89c35',1,'Eigen']]], - ['ceild_604',['ceild',['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a80a01f26587bf79f0783ef5037443103',1,'cv::gapi::own']]], - ['ceilmode_605',['ceilMode',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a7b89590e0eb5c16450434eaa69e7d920',1,'cv::dnn::PoolingLayer']]], - ['celestial_5fblue_606',['celestial_blue',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a199c10be9ce1c87d0af38ff02320c87f',1,'cv::viz::Color']]], - ['cellsize_607',['cellSize',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a5ef930c38e2b0cfcd5e5252989e056ad',1,'cv::HOGDescriptor::cellSize'],['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#aad46eb46a2435cd013f2ad164c9129dd',1,'cv::videostab::TranslationBasedLocalOutlierRejector::cellSize()']]], - ['cellsz_608',['cellSz',['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html#ab149c78d0618f70523d04f61935fda3b',1,'cv::gapi::wip::draw::Mosaic']]], - ['cend_609',['cend',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a48e703791d3549f4e4c84af68b382f99',1,'__gnu_cxx::__versa_string::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< _CharT >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< _CharT, _Traits, _Allocator >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< char >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< char, char_traits< char >, _Byte_alloc >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< char_type, _Traits, _Alloc >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< value_type >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ae56c2f3c25dc623eba9825a2e3eddd7c',1,'deque< _StateSeqT >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a702400622789c3e0f1171369f803fcb8',1,'list< __inp, __rebind_inp >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#adbf3f720ba82b5f146ca54e9db918d7f',1,'match_results< _Bi_iter >::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#adbf3f720ba82b5f146ca54e9db918d7f',1,'match_results< _Bi_iter >::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'std::basic_string::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ae56c2f3c25dc623eba9825a2e3eddd7c',1,'std::deque::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aaa651df81ec5161454becd5198407986',1,'std::forward_list::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a702400622789c3e0f1171369f803fcb8',1,'std::list::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a512508ab8aef5dad73ae92751513769e',1,'std::map::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#adbf3f720ba82b5f146ca54e9db918d7f',1,'std::match_results::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ab07754c1ec76a0bc39a9210270d939a4',1,'std::multimap::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aa61090fd58e3795f2f87e341b27c1469',1,'std::multiset::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a5d2030f67826e8bfea0b6dce51e792b7',1,'std::set::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab862dadbaf3147cfc02bd383ed35e1f9',1,'std::unordered_map::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a786093f27f238f88c21ecbfe11e27981',1,'std::unordered_map::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab862dadbaf3147cfc02bd383ed35e1f9',1,'std::unordered_map::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a786093f27f238f88c21ecbfe11e27981',1,'std::unordered_map::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#acc5c6d3a39a12f7d21e8886534eaa591',1,'std::unordered_multimap::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aeabc377e8c2f5b367388ee5e4e0aff99',1,'std::unordered_multimap::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#acc5c6d3a39a12f7d21e8886534eaa591',1,'std::unordered_multimap::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aeabc377e8c2f5b367388ee5e4e0aff99',1,'std::unordered_multimap::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a2a6edd3b4b891c1c260d3001a6b1ffcb',1,'std::unordered_multiset::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#abae4214954f75b08215d74344bc81562',1,'std::unordered_multiset::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#abae4214954f75b08215d74344bc81562',1,'std::unordered_multiset::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a155f3d6e9b8a3a59bb03969355ae5f73',1,'std::unordered_set::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a5f19f51483e14e3006bf1d6c0c7ec00a',1,'std::unordered_set::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a5f19f51483e14e3006bf1d6c0c7ec00a',1,'std::unordered_set::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'std::vector::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab862dadbaf3147cfc02bd383ed35e1f9',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a786093f27f238f88c21ecbfe11e27981',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab862dadbaf3147cfc02bd383ed35e1f9',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a786093f27f238f88c21ecbfe11e27981',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< __diff_type >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _CharClassT >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _CharT >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _Cmpt >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _Node *, _Nodeptr_Alloc >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _RealType >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _State< _TraitsT::char_type > >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _StringT >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< block_type, allocator_type >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< Catalog_info * >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< double >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< int >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< result_type >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< size_t >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< std::pair< _BiIter, int > >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< std::pair< _StateIdT, std::vector > >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< std::pair< _StrTransT, _StrTransT > >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< sub_match< _Bi_iter >, _Alloc >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< sub_match< _BiIter >, _Alloc >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb3b76f02986c2af2521d07164b5ffde',1,'Eigen::DenseBase::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb3b76f02986c2af2521d07164b5ffde',1,'DenseBase< ArrayWrapper< ExpressionType > >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb3b76f02986c2af2521d07164b5ffde',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb3b76f02986c2af2521d07164b5ffde',1,'DenseBase< Solve< Decomposition, RhsType > >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'Eigen::VectorwiseOp::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const Derived, Horizontal >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const Derived, Vertical >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::cend()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3017cf0f1a4673e904e34cfef62e7758.html#a3017cf0f1a4673e904e34cfef62e7758',1,'nlohmann::basic_json::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6cd5aaabed869c9d96801743fb4d7f6f',1,'std::cend()']]], - ['censuskernel_610',['CensusKernel',['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html',1,'cv::stereo::CensusKernel< num_images >'],['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html#ae649346d028b62eec41b6004187702d9',1,'cv::stereo::CensusKernel::CensusKernel()'],['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html#a2f555637644e6e4abd8d0d78340466c5',1,'cv::stereo::CensusKernel::CensusKernel(uint8_t **images)']]], - ['censustransform_611',['censusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a939dfbb1a0d1a3255749629343247bd5',1,'cv::stereo::censusTransform(const cv::Mat &image1, const cv::Mat &image2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2, const int type)'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#aa1a856f429cd2359d65cef9e1a60cb03',1,'cv::stereo::censusTransform(const cv::Mat &image1, int kernelSize, cv::Mat &dist1, const int type)']]], - ['center_612',['center',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#a8c6746073f8c0c4c2490a55bf3de8abf',1,'cv::gapi::wip::draw::Circle::center'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a60d492fbe1e457e2cdeac5160ed81422',1,'cv::RotatedRect::center']]], - ['central_5fmoments_613',['central_moments',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#af0f94a7b3ef144f5d831cdbf7c2ea842',1,'cv::text::ERStat']]], - ['cerr_614',['cerr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7431d56d1e8cd7a9b854171294bd71c7',1,'std::cerr'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7431d56d1e8cd7a9b854171294bd71c7',1,'std::cerr']]], - ['cerrno_615',['cerrno',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00194.html',1,'']]], - ['cfenv_616',['cfenv',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00197.html',1,'']]], - ['cfginputlayers_617',['cfgInputLayers',['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#aecac9f8f2339cf4ad732305e711c6f24',1,'cv::gapi::ie::Params']]], - ['cfgoutputlayers_618',['cfgOutputLayers',['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#a9a77772618784d0f7dc30e85f586cb3b',1,'cv::gapi::ie::Params']]], - ['cfloat_619',['cfloat',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00200.html',1,'']]], - ['chain_5fapprox_5fnone_620',['CHAIN_APPROX_NONE',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffaf7d9a3582d021d5dadcb0e37201a62f8',1,'cv::CHAIN_APPROX_NONE'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffaf7d9a3582d021d5dadcb0e37201a62f8',1,'CHAIN_APPROX_NONE(Global Namespace)']]], - ['chain_5fapprox_5fsimple_621',['CHAIN_APPROX_SIMPLE',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffa5f2883048e654999209f88ba04c302f5',1,'cv::CHAIN_APPROX_SIMPLE'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffa5f2883048e654999209f88ba04c302f5',1,'CHAIN_APPROX_SIMPLE(Global Namespace)']]], - ['chain_5fapprox_5ftc89_5fkcos_622',['CHAIN_APPROX_TC89_KCOS',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffa867e7a9ab72c8199a60e2d595d1078a3',1,'cv::CHAIN_APPROX_TC89_KCOS'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffa867e7a9ab72c8199a60e2d595d1078a3',1,'CHAIN_APPROX_TC89_KCOS(Global Namespace)']]], - ['chain_5fapprox_5ftc89_5fl1_623',['CHAIN_APPROX_TC89_L1',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffad29171855734b1cf69fb6653c5d1db35',1,'cv::CHAIN_APPROX_TC89_L1'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffad29171855734b1cf69fb6653c5d1db35',1,'CHAIN_APPROX_TC89_L1(Global Namespace)']]], - ['chan_624',['chan',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a64432cfbe7c973d05e792640f9ddac69',1,'cv::GMatDesc']]], - ['changelog_625',['Face module changelog',['https://docs.opencv.org/4.2.0/d9/d47/face_changelog.html',1,'']]], - ['changelog_2emarkdown_626',['changelog.markdown',['https://docs.opencv.org/4.2.0/de/d0f/changelog_8markdown.html',1,'']]], - ['changestate_627',['changeState',['https://docs.opencv.org/4.2.0/dc/db4/structcv_1_1ml_1_1SimulatedAnnealingSolverSystem.html#a0132f0e32f2065c5ed72fd822538e939',1,'cv::ml::SimulatedAnnealingSolverSystem']]], - ['changing_20colorspaces_628',['Changing Colorspaces',['https://docs.opencv.org/4.2.0/df/d9d/tutorial_py_colorspaces.html',1,'Changing Colorspaces'],['https://docs.opencv.org/4.2.0/db/d64/tutorial_js_colorspaces.html',1,'Changing Colorspaces']]], - ['changing_20the_20contrast_20and_20brightness_20of_20an_20image_629',['Changing the contrast and brightness of an image!',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'']]], - ['channel_20composition_20functions_630',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], - ['channel_20merge_631',['Channel merge',['https://docs.opencv.org/4.2.0/df/d2e/group__core__hal__interface__merge.html',1,'']]], - ['channel_20split_632',['Channel split',['https://docs.opencv.org/4.2.0/df/df2/group__core__hal__interface__split.html',1,'']]], - ['channel_5ftype_633',['channel_type',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4c8d83a036ea24d2704c0727782a5963',1,'cv::Mat_::channel_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4c8d83a036ea24d2704c0727782a5963',1,'Mat_< double >::channel_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4c8d83a036ea24d2704c0727782a5963',1,'Mat_< float >::channel_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4c8d83a036ea24d2704c0727782a5963',1,'Mat_< uchar >::channel_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4c8d83a036ea24d2704c0727782a5963',1,'Mat_< unsigned char >::channel_type']]], + ['cameras_163',['cameras',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#af9097e2b658dc1d3d57763c3fefd40aa',1,'cv::Stitcher']]], + ['camerastreamtask_164',['CameraStreamTask',['../classnet_1_1mc_1_1tasks_1_1CameraStreamTask.html',1,'net::mc::tasks']]], + ['cameravertex_165',['cameraVertex',['https://docs.opencv.org/4.2.0/df/db0/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1edge.html#a18e6069280ce9e1ade0ea2357fd81308',1,'cv::multicalib::MultiCameraCalibration::edge']]], + ['camshift_166',['CamShift',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gaef2bd39c8356f423124f1fe7c44d54a1',1,'cv::CamShift()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gaef2bd39c8356f423124f1fe7c44d54a1',1,'CamShift(InputArray probImage, Rect &window, TermCriteria criteria)(Global Namespace)']]], + ['camshift_167',['Camshift',['https://docs.opencv.org/4.2.0/d7/d00/tutorial_meanshift.html',1,'Meanshift and Camshift'],['https://docs.opencv.org/4.2.0/db/df8/tutorial_py_meanshift.html',1,'Meanshift and Camshift'],['https://docs.opencv.org/4.2.0/df/def/tutorial_js_meanshift.html',1,'Meanshift and Camshift']]], + ['can_168',['can',['../namespacecan.html',1,'']]], + ['can_3a_3amotor_169',['motor',['../namespacecan_1_1motor.html',1,'can']]], + ['can_5fdescribe_170',['can_describe',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#acd80cf3f542d39ca2d1b5688e917aad3',1,'cv::can_describe(const GMetaArg &meta, const GRunArg &arg)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#adeef82445e8695e38c9eea17281a62c6',1,'cv::can_describe(const GMetaArgs &metas, const GRunArgs &args)']]], + ['can_5fmotor_171',['can_motor',['../classrobot_1_1can__motor.html',1,'robot::can_motor'],['../classrobot_1_1can__motor.html#ad9516b34a81d5bd06d337b0fc4bcc5e0',1,'robot::can_motor::can_motor()']]], + ['cancel_172',['cancel',['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1gapi_1_1wip_1_1GAsyncContext.html#a90ca03859848638a92ff5ab0780ce810',1,'cv::gapi::wip::GAsyncContext']]], + ['cancreatealias_173',['canCreateAlias',['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#a8c9dd58298eed71239fbf5da38e79480',1,'cv::ocl::Image2D']]], + ['candescribe_174',['canDescribe',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a4eb272351ccdf19f1236fc68bcc8a4be',1,'cv::GMatDesc::canDescribe(const cv::gapi::own::Mat &mat) const'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#af5ff4c580b9c3d2162ae4d6ff9c0537e',1,'cv::GMatDesc::canDescribe(const cv::Mat &mat) const']]], + ['candidate_175',['Candidate',['https://docs.opencv.org/4.2.0/df/da3/structcv_1_1linemod_1_1QuantizedPyramid_1_1Candidate.html',1,'cv::linemod::QuantizedPyramid::Candidate'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaf3cb84fcb9d153e9118ce05ac85a9661',1,'cv::linemod::QuantizedPyramid::Candidate::Candidate()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaf3cb84fcb9d153e9118ce05ac85a9661',1,'Candidate()(Global Namespace)']]], + ['canmaphostmemory_176',['canMapHostMemory',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8345db2ebf373ccdd0704ec9554a5ce5',1,'cv::cuda::DeviceInfo']]], + ['canny_177',['Canny',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga04723e007ed888ddf11d9ba04e2232de',1,'cv::Canny(InputArray image, OutputArray edges, double threshold1, double threshold2, int apertureSize=3, bool L2gradient=false)'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga2a671611e104c093843d7b7fc46d24af',1,'cv::Canny(InputArray dx, InputArray dy, OutputArray edges, double threshold1, double threshold2, bool L2gradient=false)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gad93b9f85e6abecc152d05d3e75bac37a',1,'cv::gapi::Canny()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga04723e007ed888ddf11d9ba04e2232de',1,'Canny(InputArray image, OutputArray edges, double threshold1, double threshold2, int apertureSize=3, bool L2gradient=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga2a671611e104c093843d7b7fc46d24af',1,'Canny(InputArray dx, InputArray dy, OutputArray edges, double threshold1, double threshold2, bool L2gradient=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gad93b9f85e6abecc152d05d3e75bac37a',1,'Canny(const GMat &image, double threshold1, double threshold2, int apertureSize=3, bool L2gradient=false)(Global Namespace)']]], + ['canny_20edge_20detection_178',['Canny Edge Detection',['https://docs.opencv.org/4.2.0/da/d22/tutorial_py_canny.html',1,'Canny Edge Detection'],['https://docs.opencv.org/4.2.0/d7/de1/tutorial_js_canny.html',1,'Canny Edge Detection']]], + ['canny_20edge_20detector_179',['Canny Edge Detector',['https://docs.opencv.org/4.2.0/da/d5c/tutorial_canny_detector.html',1,'']]], + ['canny_5fdetector_2emarkdown_180',['canny_detector.markdown',['https://docs.opencv.org/4.2.0/d0/d6f/canny__detector_8markdown.html',1,'']]], + ['cannyedgedetector_181',['CannyEdgeDetector',['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html',1,'cv::cuda']]], + ['canonical_182',['canonical',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#af060c2cb5335bc792026ed4499d583c5',1,'cv::utils::fs']]], + ['canreshape_183',['canReshape',['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a772dd5e07d0b01894805d920c1f10c24',1,'cv::GCompiled']]], + ['cap_184',['cap',['https://docs.opencv.org/4.2.0/dd/d1c/classcv_1_1gapi_1_1wip_1_1GCaptureSource.html#aa2cb96618d16f46f6a8765d7b7368901',1,'cv::gapi::wip::GCaptureSource::cap'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a8c6d7b52a28206072d540c9567874649',1,'cv::VideoCapture::cap']]], + ['cap_2ehpp_185',['cap.hpp',['https://docs.opencv.org/4.2.0/d8/dd3/cap_8hpp.html',1,'']]], + ['cap_5fandroid_186',['CAP_ANDROID',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da0a3b80ec023425a27431991500d26847',1,'cv::CAP_ANDROID'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da0a3b80ec023425a27431991500d26847',1,'CAP_ANDROID(Global Namespace)']]], + ['cap_5fany_187',['CAP_ANY',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da77ab1fe260fd182f8ec7655fab27a31d',1,'cv::CAP_ANY'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da77ab1fe260fd182f8ec7655fab27a31d',1,'CAP_ANY(Global Namespace)']]], + ['cap_5faravis_188',['CAP_ARAVIS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da154dbbfdbcd9aee0ebcbca984479c57a',1,'cv::CAP_ARAVIS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da154dbbfdbcd9aee0ebcbca984479c57a',1,'CAP_ARAVIS(Global Namespace)']]], + ['cap_5favfoundation_189',['CAP_AVFOUNDATION',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dad40e88621d29a819d17f14207cb12326',1,'cv::CAP_AVFOUNDATION'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dad40e88621d29a819d17f14207cb12326',1,'CAP_AVFOUNDATION(Global Namespace)']]], + ['cap_5fcmu1394_190',['CAP_CMU1394',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da50f0063ddd92eae7eb4c9d5657c57f01',1,'cv::CAP_CMU1394'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da50f0063ddd92eae7eb4c9d5657c57f01',1,'CAP_CMU1394(Global Namespace)']]], + ['cap_5fdc1394_191',['CAP_DC1394',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da90613927859093cb37c9df3acf47061b',1,'cv::CAP_DC1394'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da90613927859093cb37c9df3acf47061b',1,'CAP_DC1394(Global Namespace)']]], + ['cap_5fdshow_192',['CAP_DSHOW',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dab6ac3effa04f41ed5470375c85a23504',1,'cv::CAP_DSHOW'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dab6ac3effa04f41ed5470375c85a23504',1,'CAP_DSHOW(Global Namespace)']]], + ['cap_5fffmpeg_193',['CAP_FFMPEG',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dacf10e9692c4166f74de62b7d00c377d0',1,'cv::CAP_FFMPEG'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dacf10e9692c4166f74de62b7d00c377d0',1,'CAP_FFMPEG(Global Namespace)']]], + ['cap_5ffireware_194',['CAP_FIREWARE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dab51c7fc9cc4dda4f63f9a86dc3212f89',1,'cv::CAP_FIREWARE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dab51c7fc9cc4dda4f63f9a86dc3212f89',1,'CAP_FIREWARE(Global Namespace)']]], + ['cap_5ffirewire_195',['CAP_FIREWIRE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da8555c783cb62cdc666806d3faf8efa09',1,'cv::CAP_FIREWIRE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da8555c783cb62cdc666806d3faf8efa09',1,'CAP_FIREWIRE(Global Namespace)']]], + ['cap_5fgiganetix_196',['CAP_GIGANETIX',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daf4dde3ebf402904bf78b40956035b766',1,'cv::CAP_GIGANETIX'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daf4dde3ebf402904bf78b40956035b766',1,'CAP_GIGANETIX(Global Namespace)']]], + ['cap_5fgphoto2_197',['CAP_GPHOTO2',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da96c457f30fddf85dc689f940a4c07807',1,'cv::CAP_GPHOTO2'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da96c457f30fddf85dc689f940a4c07807',1,'CAP_GPHOTO2(Global Namespace)']]], + ['cap_5fgstreamer_198',['CAP_GSTREAMER',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da38dcac6866f7608675dd35ba0b9c3c07',1,'cv::CAP_GSTREAMER'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da38dcac6866f7608675dd35ba0b9c3c07',1,'CAP_GSTREAMER(Global Namespace)']]], + ['cap_5fieee1394_199',['CAP_IEEE1394',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daf1b3045737ea7a591c26d6050a5a4755',1,'cv::CAP_IEEE1394'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daf1b3045737ea7a591c26d6050a5a4755',1,'CAP_IEEE1394(Global Namespace)']]], + ['cap_5fimages_200',['CAP_IMAGES',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dabe73da7a65e66cdd47c87733a4ea6ef0',1,'cv::CAP_IMAGES'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dabe73da7a65e66cdd47c87733a4ea6ef0',1,'CAP_IMAGES(Global Namespace)']]], + ['cap_5fintel_5fmfx_201',['CAP_INTEL_MFX',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da7212c0c08fcb32247b7cdb62466955f4',1,'cv::CAP_INTEL_MFX'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da7212c0c08fcb32247b7cdb62466955f4',1,'CAP_INTEL_MFX(Global Namespace)']]], + ['cap_5fintelperc_202',['CAP_INTELPERC',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dabe0df46cd132d1cfbae88efd6f4becdf',1,'cv::CAP_INTELPERC'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dabe0df46cd132d1cfbae88efd6f4becdf',1,'CAP_INTELPERC(Global Namespace)']]], + ['cap_5fintelperc_5fdepth_5fgenerator_203',['CAP_INTELPERC_DEPTH_GENERATOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132caf09153f3c7f98ceb038d39453da205cf',1,'cv::CAP_INTELPERC_DEPTH_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132caf09153f3c7f98ceb038d39453da205cf',1,'cv::CAP_INTELPERC_DEPTH_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132caf09153f3c7f98ceb038d39453da205cf',1,'CAP_INTELPERC_DEPTH_GENERATOR(Global Namespace)']]], + ['cap_5fintelperc_5fdepth_5fmap_204',['CAP_INTELPERC_DEPTH_MAP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a0633813010b6c21838951de5fb34d643',1,'cv::CAP_INTELPERC_DEPTH_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a0633813010b6c21838951de5fb34d643',1,'cv::CAP_INTELPERC_DEPTH_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a0633813010b6c21838951de5fb34d643',1,'CAP_INTELPERC_DEPTH_MAP(Global Namespace)']]], + ['cap_5fintelperc_5fgenerators_5fmask_205',['CAP_INTELPERC_GENERATORS_MASK',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132cabae15b45bbfb9ace04d86ff77e438e4e',1,'cv::CAP_INTELPERC_GENERATORS_MASK'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132cabae15b45bbfb9ace04d86ff77e438e4e',1,'cv::CAP_INTELPERC_GENERATORS_MASK'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132cabae15b45bbfb9ace04d86ff77e438e4e',1,'CAP_INTELPERC_GENERATORS_MASK(Global Namespace)']]], + ['cap_5fintelperc_5fimage_206',['CAP_INTELPERC_IMAGE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a5c722445f6d9324474cf50b39b92ae74',1,'cv::CAP_INTELPERC_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a5c722445f6d9324474cf50b39b92ae74',1,'cv::CAP_INTELPERC_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a5c722445f6d9324474cf50b39b92ae74',1,'CAP_INTELPERC_IMAGE(Global Namespace)']]], + ['cap_5fintelperc_5fimage_5fgenerator_207',['CAP_INTELPERC_IMAGE_GENERATOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132ca428daa198f3d2593d78abca6348c125d',1,'cv::CAP_INTELPERC_IMAGE_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132ca428daa198f3d2593d78abca6348c125d',1,'cv::CAP_INTELPERC_IMAGE_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132ca428daa198f3d2593d78abca6348c125d',1,'CAP_INTELPERC_IMAGE_GENERATOR(Global Namespace)']]], + ['cap_5fintelperc_5fir_5fgenerator_208',['CAP_INTELPERC_IR_GENERATOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132caf40091a565b49a9554c42e8a3c006936',1,'cv::CAP_INTELPERC_IR_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132caf40091a565b49a9554c42e8a3c006936',1,'cv::CAP_INTELPERC_IR_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga0343dfaf2462eb1fd90ef5d3b642132caf40091a565b49a9554c42e8a3c006936',1,'CAP_INTELPERC_IR_GENERATOR(Global Namespace)']]], + ['cap_5fintelperc_5fir_5fmap_209',['CAP_INTELPERC_IR_MAP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a56fd50220f952776712bcfb656a5c64d',1,'cv::CAP_INTELPERC_IR_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a56fd50220f952776712bcfb656a5c64d',1,'cv::CAP_INTELPERC_IR_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9a56fd50220f952776712bcfb656a5c64d',1,'CAP_INTELPERC_IR_MAP(Global Namespace)']]], + ['cap_5fintelperc_5fuvdepth_5fmap_210',['CAP_INTELPERC_UVDEPTH_MAP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9aaafadc6ce2abb8a2e962b2d4115a0f48',1,'cv::CAP_INTELPERC_UVDEPTH_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9aaafadc6ce2abb8a2e962b2d4115a0f48',1,'cv::CAP_INTELPERC_UVDEPTH_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaa54b7c54ed4ccfdb606549a42d3553b9aaafadc6ce2abb8a2e962b2d4115a0f48',1,'CAP_INTELPERC_UVDEPTH_MAP(Global Namespace)']]], + ['cap_5fios_2eh_211',['cap_ios.h',['https://docs.opencv.org/4.2.0/d9/d4d/cap__ios_8h.html',1,'']]], + ['cap_5fmsmf_212',['CAP_MSMF',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da278d5ad4907c9c0fe6d1c6104b746019',1,'cv::CAP_MSMF'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da278d5ad4907c9c0fe6d1c6104b746019',1,'CAP_MSMF(Global Namespace)']]], + ['cap_5fopencv_5fmjpeg_213',['CAP_OPENCV_MJPEG',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da30dc8f8843e26aa10d401799f62eaa25',1,'cv::CAP_OPENCV_MJPEG'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da30dc8f8843e26aa10d401799f62eaa25',1,'CAP_OPENCV_MJPEG(Global Namespace)']]], + ['cap_5fopenni_214',['CAP_OPENNI',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daa073098573ce0968cb7a79de1a5ce0ee',1,'cv::CAP_OPENNI'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daa073098573ce0968cb7a79de1a5ce0ee',1,'CAP_OPENNI(Global Namespace)']]], + ['cap_5fopenni2_215',['CAP_OPENNI2',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dabfd6ffd761dc1b2841b5595f089412e7',1,'cv::CAP_OPENNI2'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dabfd6ffd761dc1b2841b5595f089412e7',1,'CAP_OPENNI2(Global Namespace)']]], + ['cap_5fopenni2_5fasus_216',['CAP_OPENNI2_ASUS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da2c24b5fa88b2d575c3555f2732899937',1,'cv::CAP_OPENNI2_ASUS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da2c24b5fa88b2d575c3555f2732899937',1,'CAP_OPENNI2_ASUS(Global Namespace)']]], + ['cap_5fopenni_5fasus_217',['CAP_OPENNI_ASUS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da19bf6cb6cd40b856d55867ce1a88f7af',1,'cv::CAP_OPENNI_ASUS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da19bf6cb6cd40b856d55867ce1a88f7af',1,'CAP_OPENNI_ASUS(Global Namespace)']]], + ['cap_5fopenni_5fbgr_5fimage_218',['CAP_OPENNI_BGR_IMAGE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a467bac9001f40dea888f47ac55886c23',1,'cv::CAP_OPENNI_BGR_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a467bac9001f40dea888f47ac55886c23',1,'cv::CAP_OPENNI_BGR_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a467bac9001f40dea888f47ac55886c23',1,'CAP_OPENNI_BGR_IMAGE(Global Namespace)']]], + ['cap_5fopenni_5fdepth_5fgenerator_219',['CAP_OPENNI_DEPTH_GENERATOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a803680384669d80d0294ad7836ec57e6',1,'cv::CAP_OPENNI_DEPTH_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a803680384669d80d0294ad7836ec57e6',1,'cv::CAP_OPENNI_DEPTH_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a803680384669d80d0294ad7836ec57e6',1,'CAP_OPENNI_DEPTH_GENERATOR(Global Namespace)']]], + ['cap_5fopenni_5fdepth_5fgenerator_5fbaseline_220',['CAP_OPENNI_DEPTH_GENERATOR_BASELINE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966afefc8beb33fe05b3729b422678893215',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_BASELINE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966afefc8beb33fe05b3729b422678893215',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_BASELINE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966afefc8beb33fe05b3729b422678893215',1,'CAP_OPENNI_DEPTH_GENERATOR_BASELINE(Global Namespace)']]], + ['cap_5fopenni_5fdepth_5fgenerator_5ffocal_5flength_221',['CAP_OPENNI_DEPTH_GENERATOR_FOCAL_LENGTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a8033186b1063aa190fd91661aac79b5d',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a8033186b1063aa190fd91661aac79b5d',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a8033186b1063aa190fd91661aac79b5d',1,'CAP_OPENNI_DEPTH_GENERATOR_FOCAL_LENGTH(Global Namespace)']]], + ['cap_5fopenni_5fdepth_5fgenerator_5fpresent_222',['CAP_OPENNI_DEPTH_GENERATOR_PRESENT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a35506303a7585ddfaf30ad453704af13',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a35506303a7585ddfaf30ad453704af13',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a35506303a7585ddfaf30ad453704af13',1,'CAP_OPENNI_DEPTH_GENERATOR_PRESENT(Global Namespace)']]], + ['cap_5fopenni_5fdepth_5fgenerator_5fregistration_223',['CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a4bfc7955622984b48420bf8fecda6388',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a4bfc7955622984b48420bf8fecda6388',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a4bfc7955622984b48420bf8fecda6388',1,'CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION(Global Namespace)']]], + ['cap_5fopenni_5fdepth_5fgenerator_5fregistration_5fon_224',['CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION_ON',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a5c1c8b4e40121d8a906d39d772117700',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION_ON'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a5c1c8b4e40121d8a906d39d772117700',1,'cv::CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION_ON'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a5c1c8b4e40121d8a906d39d772117700',1,'CAP_OPENNI_DEPTH_GENERATOR_REGISTRATION_ON(Global Namespace)']]], + ['cap_5fopenni_5fdepth_5fmap_225',['CAP_OPENNI_DEPTH_MAP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a2278fe906c8f7508e6e7a92f46888661',1,'cv::CAP_OPENNI_DEPTH_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a2278fe906c8f7508e6e7a92f46888661',1,'cv::CAP_OPENNI_DEPTH_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a2278fe906c8f7508e6e7a92f46888661',1,'CAP_OPENNI_DEPTH_MAP(Global Namespace)']]], + ['cap_5fopenni_5fdisparity_5fmap_226',['CAP_OPENNI_DISPARITY_MAP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a549229ff705c2c4d637712b93041e06f',1,'cv::CAP_OPENNI_DISPARITY_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a549229ff705c2c4d637712b93041e06f',1,'cv::CAP_OPENNI_DISPARITY_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a549229ff705c2c4d637712b93041e06f',1,'CAP_OPENNI_DISPARITY_MAP(Global Namespace)']]], + ['cap_5fopenni_5fdisparity_5fmap_5f32f_227',['CAP_OPENNI_DISPARITY_MAP_32F',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a471838d1ee511e9555d07abe076db5b1',1,'cv::CAP_OPENNI_DISPARITY_MAP_32F'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a471838d1ee511e9555d07abe076db5b1',1,'cv::CAP_OPENNI_DISPARITY_MAP_32F'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a471838d1ee511e9555d07abe076db5b1',1,'CAP_OPENNI_DISPARITY_MAP_32F(Global Namespace)']]], + ['cap_5fopenni_5fgenerators_5fmask_228',['CAP_OPENNI_GENERATORS_MASK',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462aa78452e84ffa2e3544cb0006ed89e842',1,'cv::CAP_OPENNI_GENERATORS_MASK'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462aa78452e84ffa2e3544cb0006ed89e842',1,'cv::CAP_OPENNI_GENERATORS_MASK'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462aa78452e84ffa2e3544cb0006ed89e842',1,'CAP_OPENNI_GENERATORS_MASK(Global Namespace)']]], + ['cap_5fopenni_5fgray_5fimage_229',['CAP_OPENNI_GRAY_IMAGE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75ae9fad51a17faff9b4351ccaa6b8375ba',1,'cv::CAP_OPENNI_GRAY_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75ae9fad51a17faff9b4351ccaa6b8375ba',1,'cv::CAP_OPENNI_GRAY_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75ae9fad51a17faff9b4351ccaa6b8375ba',1,'CAP_OPENNI_GRAY_IMAGE(Global Namespace)']]], + ['cap_5fopenni_5fimage_5fgenerator_230',['CAP_OPENNI_IMAGE_GENERATOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a88571cf323ed746cfad77160272fe593',1,'cv::CAP_OPENNI_IMAGE_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a88571cf323ed746cfad77160272fe593',1,'cv::CAP_OPENNI_IMAGE_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a88571cf323ed746cfad77160272fe593',1,'CAP_OPENNI_IMAGE_GENERATOR(Global Namespace)']]], + ['cap_5fopenni_5fimage_5fgenerator_5foutput_5fmode_231',['CAP_OPENNI_IMAGE_GENERATOR_OUTPUT_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a241b67030848f3bcf223d18ebfe75adc',1,'cv::CAP_OPENNI_IMAGE_GENERATOR_OUTPUT_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a241b67030848f3bcf223d18ebfe75adc',1,'cv::CAP_OPENNI_IMAGE_GENERATOR_OUTPUT_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a241b67030848f3bcf223d18ebfe75adc',1,'CAP_OPENNI_IMAGE_GENERATOR_OUTPUT_MODE(Global Namespace)']]], + ['cap_5fopenni_5fimage_5fgenerator_5fpresent_232',['CAP_OPENNI_IMAGE_GENERATOR_PRESENT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966ab1d78bb8b7e062f4bc14d7db3eccf9b9',1,'cv::CAP_OPENNI_IMAGE_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966ab1d78bb8b7e062f4bc14d7db3eccf9b9',1,'cv::CAP_OPENNI_IMAGE_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966ab1d78bb8b7e062f4bc14d7db3eccf9b9',1,'CAP_OPENNI_IMAGE_GENERATOR_PRESENT(Global Namespace)']]], + ['cap_5fopenni_5fir_5fgenerator_233',['CAP_OPENNI_IR_GENERATOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a895744d25aea6269227db6d4d2b30e68',1,'cv::CAP_OPENNI_IR_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a895744d25aea6269227db6d4d2b30e68',1,'cv::CAP_OPENNI_IR_GENERATOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga618fac6b6e9a83116851a7c93378d462a895744d25aea6269227db6d4d2b30e68',1,'CAP_OPENNI_IR_GENERATOR(Global Namespace)']]], + ['cap_5fopenni_5fir_5fgenerator_5fpresent_234',['CAP_OPENNI_IR_GENERATOR_PRESENT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a60014cf8395b41a0918be79e63ef0a03',1,'cv::CAP_OPENNI_IR_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a60014cf8395b41a0918be79e63ef0a03',1,'cv::CAP_OPENNI_IR_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga4a5821d9216a2a8593cc349cc7fdf966a60014cf8395b41a0918be79e63ef0a03',1,'CAP_OPENNI_IR_GENERATOR_PRESENT(Global Namespace)']]], + ['cap_5fopenni_5fir_5fimage_235',['CAP_OPENNI_IR_IMAGE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a39da5760ecb602bb5f31b2889ee7f9ae',1,'cv::CAP_OPENNI_IR_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a39da5760ecb602bb5f31b2889ee7f9ae',1,'cv::CAP_OPENNI_IR_IMAGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a39da5760ecb602bb5f31b2889ee7f9ae',1,'CAP_OPENNI_IR_IMAGE(Global Namespace)']]], + ['cap_5fopenni_5fpoint_5fcloud_5fmap_236',['CAP_OPENNI_POINT_CLOUD_MAP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a9025b0faf50e561b874405f7013f43dd',1,'cv::CAP_OPENNI_POINT_CLOUD_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a9025b0faf50e561b874405f7013f43dd',1,'cv::CAP_OPENNI_POINT_CLOUD_MAP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a9025b0faf50e561b874405f7013f43dd',1,'CAP_OPENNI_POINT_CLOUD_MAP(Global Namespace)']]], + ['cap_5fopenni_5fqvga_5f30hz_237',['CAP_OPENNI_QVGA_30HZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa6ae35b3670500dd309e0797781ffc46b',1,'cv::CAP_OPENNI_QVGA_30HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa6ae35b3670500dd309e0797781ffc46b',1,'cv::CAP_OPENNI_QVGA_30HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa6ae35b3670500dd309e0797781ffc46b',1,'CAP_OPENNI_QVGA_30HZ(Global Namespace)']]], + ['cap_5fopenni_5fqvga_5f60hz_238',['CAP_OPENNI_QVGA_60HZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa5db747b95207d3086eff4e58ce68f495',1,'cv::CAP_OPENNI_QVGA_60HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa5db747b95207d3086eff4e58ce68f495',1,'cv::CAP_OPENNI_QVGA_60HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa5db747b95207d3086eff4e58ce68f495',1,'CAP_OPENNI_QVGA_60HZ(Global Namespace)']]], + ['cap_5fopenni_5fsxga_5f15hz_239',['CAP_OPENNI_SXGA_15HZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfaac4de9c7e74b115c82b996e5a9de738b',1,'cv::CAP_OPENNI_SXGA_15HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfaac4de9c7e74b115c82b996e5a9de738b',1,'cv::CAP_OPENNI_SXGA_15HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfaac4de9c7e74b115c82b996e5a9de738b',1,'CAP_OPENNI_SXGA_15HZ(Global Namespace)']]], + ['cap_5fopenni_5fsxga_5f30hz_240',['CAP_OPENNI_SXGA_30HZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa170b676fb0471be44394d7c600787872',1,'cv::CAP_OPENNI_SXGA_30HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa170b676fb0471be44394d7c600787872',1,'cv::CAP_OPENNI_SXGA_30HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa170b676fb0471be44394d7c600787872',1,'CAP_OPENNI_SXGA_30HZ(Global Namespace)']]], + ['cap_5fopenni_5fvalid_5fdepth_5fmask_241',['CAP_OPENNI_VALID_DEPTH_MASK',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a4cc33615f4869c0a2eda62587b945fb9',1,'cv::CAP_OPENNI_VALID_DEPTH_MASK'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a4cc33615f4869c0a2eda62587b945fb9',1,'cv::CAP_OPENNI_VALID_DEPTH_MASK'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga9817e2bad3908e54fcf16ffed015ff75a4cc33615f4869c0a2eda62587b945fb9',1,'CAP_OPENNI_VALID_DEPTH_MASK(Global Namespace)']]], + ['cap_5fopenni_5fvga_5f30hz_242',['CAP_OPENNI_VGA_30HZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa08a35a2f66b2d645eb7817e852ff8ddc',1,'cv::CAP_OPENNI_VGA_30HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa08a35a2f66b2d645eb7817e852ff8ddc',1,'cv::CAP_OPENNI_VGA_30HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaeb44e5d729d41902496454c281d5adbfa08a35a2f66b2d645eb7817e852ff8ddc',1,'CAP_OPENNI_VGA_30HZ(Global Namespace)']]], + ['cap_5fprop_5faperture_243',['CAP_PROP_APERTURE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa368193e813f38cd561e44c432ac035d0',1,'cv::CAP_PROP_APERTURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa368193e813f38cd561e44c432ac035d0',1,'cv::CAP_PROP_APERTURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa368193e813f38cd561e44c432ac035d0',1,'CAP_PROP_APERTURE(Global Namespace)']]], + ['cap_5fprop_5fauto_5fexposure_244',['CAP_PROP_AUTO_EXPOSURE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da5c790a640b290f73fcd279e8bbaf0f13',1,'cv::CAP_PROP_AUTO_EXPOSURE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da5c790a640b290f73fcd279e8bbaf0f13',1,'CAP_PROP_AUTO_EXPOSURE(Global Namespace)']]], + ['cap_5fprop_5fauto_5fwb_245',['CAP_PROP_AUTO_WB',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da762391cbaa101c4015e6a935aa0cfc95',1,'cv::CAP_PROP_AUTO_WB'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da762391cbaa101c4015e6a935aa0cfc95',1,'CAP_PROP_AUTO_WB(Global Namespace)']]], + ['cap_5fprop_5fautofocus_246',['CAP_PROP_AUTOFOCUS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad937a854bd8d1ca73edfb3570e799aa3',1,'cv::CAP_PROP_AUTOFOCUS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad937a854bd8d1ca73edfb3570e799aa3',1,'CAP_PROP_AUTOFOCUS(Global Namespace)']]], + ['cap_5fprop_5fbackend_247',['CAP_PROP_BACKEND',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da0bdf71aedd96f43adf1dc007cc2cff85',1,'cv::CAP_PROP_BACKEND'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da0bdf71aedd96f43adf1dc007cc2cff85',1,'CAP_PROP_BACKEND(Global Namespace)']]], + ['cap_5fprop_5fbacklight_248',['CAP_PROP_BACKLIGHT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da291cc06a405ecd99d074d051d98a3931',1,'cv::CAP_PROP_BACKLIGHT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da291cc06a405ecd99d074d051d98a3931',1,'CAP_PROP_BACKLIGHT(Global Namespace)']]], + ['cap_5fprop_5fbrightness_249',['CAP_PROP_BRIGHTNESS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da95753013fd8f0c0af3f743dc0293844b',1,'cv::CAP_PROP_BRIGHTNESS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da95753013fd8f0c0af3f743dc0293844b',1,'CAP_PROP_BRIGHTNESS(Global Namespace)']]], + ['cap_5fprop_5fbuffersize_250',['CAP_PROP_BUFFERSIZE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da5014616457bfb833d3ec00c4b7f31342',1,'cv::CAP_PROP_BUFFERSIZE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da5014616457bfb833d3ec00c4b7f31342',1,'CAP_PROP_BUFFERSIZE(Global Namespace)']]], + ['cap_5fprop_5fchannel_251',['CAP_PROP_CHANNEL',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da2f6d968016612b1d87c9895e75a6449a',1,'cv::CAP_PROP_CHANNEL'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da2f6d968016612b1d87c9895e75a6449a',1,'CAP_PROP_CHANNEL(Global Namespace)']]], + ['cap_5fprop_5fcodec_5fpixel_5fformat_252',['CAP_PROP_CODEC_PIXEL_FORMAT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6221cfac2d7ab4d84b38bff91949fa6c',1,'cv::CAP_PROP_CODEC_PIXEL_FORMAT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6221cfac2d7ab4d84b38bff91949fa6c',1,'CAP_PROP_CODEC_PIXEL_FORMAT(Global Namespace)']]], + ['cap_5fprop_5fcontrast_253',['CAP_PROP_CONTRAST',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dae412ca134669abd128476d5afe41e29c',1,'cv::CAP_PROP_CONTRAST'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dae412ca134669abd128476d5afe41e29c',1,'CAP_PROP_CONTRAST(Global Namespace)']]], + ['cap_5fprop_5fconvert_5frgb_254',['CAP_PROP_CONVERT_RGB',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad0bb457c76e2b01024ecb3a85e75af29',1,'cv::CAP_PROP_CONVERT_RGB'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad0bb457c76e2b01024ecb3a85e75af29',1,'CAP_PROP_CONVERT_RGB(Global Namespace)']]], + ['cap_5fprop_5fdc1394_5fmax_255',['CAP_PROP_DC1394_MAX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8abb0d92c98e8d5017993b699661eac161',1,'cv::CAP_PROP_DC1394_MAX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8abb0d92c98e8d5017993b699661eac161',1,'cv::CAP_PROP_DC1394_MAX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8abb0d92c98e8d5017993b699661eac161',1,'CAP_PROP_DC1394_MAX(Global Namespace)']]], + ['cap_5fprop_5fdc1394_5fmode_5fauto_256',['CAP_PROP_DC1394_MODE_AUTO',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8adbadd629b9386316a1837103d147e180',1,'cv::CAP_PROP_DC1394_MODE_AUTO'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8adbadd629b9386316a1837103d147e180',1,'cv::CAP_PROP_DC1394_MODE_AUTO'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8adbadd629b9386316a1837103d147e180',1,'CAP_PROP_DC1394_MODE_AUTO(Global Namespace)']]], + ['cap_5fprop_5fdc1394_5fmode_5fmanual_257',['CAP_PROP_DC1394_MODE_MANUAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8ad4e4849dd1d36d22ae451ae9241cf780',1,'cv::CAP_PROP_DC1394_MODE_MANUAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8ad4e4849dd1d36d22ae451ae9241cf780',1,'cv::CAP_PROP_DC1394_MODE_MANUAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8ad4e4849dd1d36d22ae451ae9241cf780',1,'CAP_PROP_DC1394_MODE_MANUAL(Global Namespace)']]], + ['cap_5fprop_5fdc1394_5fmode_5fone_5fpush_5fauto_258',['CAP_PROP_DC1394_MODE_ONE_PUSH_AUTO',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8a93ed17f4467068f9fb5d0b72cff48cfd',1,'cv::CAP_PROP_DC1394_MODE_ONE_PUSH_AUTO'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8a93ed17f4467068f9fb5d0b72cff48cfd',1,'cv::CAP_PROP_DC1394_MODE_ONE_PUSH_AUTO'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8a93ed17f4467068f9fb5d0b72cff48cfd',1,'CAP_PROP_DC1394_MODE_ONE_PUSH_AUTO(Global Namespace)']]], + ['cap_5fprop_5fdc1394_5foff_259',['CAP_PROP_DC1394_OFF',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8acf2cc1c71097ed0b4a41835469c7442f',1,'cv::CAP_PROP_DC1394_OFF'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8acf2cc1c71097ed0b4a41835469c7442f',1,'cv::CAP_PROP_DC1394_OFF'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga036967f9ac6199fae0f51818ac371ca8acf2cc1c71097ed0b4a41835469c7442f',1,'CAP_PROP_DC1394_OFF(Global Namespace)']]], + ['cap_5fprop_5fexposure_260',['CAP_PROP_EXPOSURE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dafb6cd2b43344f0458c13863354989623',1,'cv::CAP_PROP_EXPOSURE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dafb6cd2b43344f0458c13863354989623',1,'CAP_PROP_EXPOSURE(Global Namespace)']]], + ['cap_5fprop_5fexposureprogram_261',['CAP_PROP_EXPOSUREPROGRAM',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa32983621756658f76b5f0ab5388940d7',1,'cv::CAP_PROP_EXPOSUREPROGRAM'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa32983621756658f76b5f0ab5388940d7',1,'cv::CAP_PROP_EXPOSUREPROGRAM'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa32983621756658f76b5f0ab5388940d7',1,'CAP_PROP_EXPOSUREPROGRAM(Global Namespace)']]], + ['cap_5fprop_5ffocus_262',['CAP_PROP_FOCUS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da25fe3d87b62a918427d49f3d43aef714',1,'cv::CAP_PROP_FOCUS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da25fe3d87b62a918427d49f3d43aef714',1,'CAP_PROP_FOCUS(Global Namespace)']]], + ['cap_5fprop_5fformat_263',['CAP_PROP_FORMAT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da171e1ed33a7c1280a9d2c869732f226c',1,'cv::CAP_PROP_FORMAT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da171e1ed33a7c1280a9d2c869732f226c',1,'CAP_PROP_FORMAT(Global Namespace)']]], + ['cap_5fprop_5ffourcc_264',['CAP_PROP_FOURCC',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da53e1c28d4c2ca10732af106f3bf00613',1,'cv::CAP_PROP_FOURCC'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da53e1c28d4c2ca10732af106f3bf00613',1,'CAP_PROP_FOURCC(Global Namespace)']]], + ['cap_5fprop_5ffps_265',['CAP_PROP_FPS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daf01bc92359d2abc9e6eeb5cbe36d9af2',1,'cv::CAP_PROP_FPS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daf01bc92359d2abc9e6eeb5cbe36d9af2',1,'CAP_PROP_FPS(Global Namespace)']]], + ['cap_5fprop_5fframe_5fcount_266',['CAP_PROP_FRAME_COUNT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dadadc646b31cfd2194794a3a80b8fa6c2',1,'cv::CAP_PROP_FRAME_COUNT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dadadc646b31cfd2194794a3a80b8fa6c2',1,'CAP_PROP_FRAME_COUNT(Global Namespace)']]], + ['cap_5fprop_5fframe_5fheight_267',['CAP_PROP_FRAME_HEIGHT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad8b57083fd9bd58e0f94e68a54b42b7e',1,'cv::CAP_PROP_FRAME_HEIGHT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad8b57083fd9bd58e0f94e68a54b42b7e',1,'CAP_PROP_FRAME_HEIGHT(Global Namespace)']]], + ['cap_5fprop_5fframe_5fwidth_268',['CAP_PROP_FRAME_WIDTH',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dab26d2ba37086662261148e9fe93eecad',1,'cv::CAP_PROP_FRAME_WIDTH'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dab26d2ba37086662261148e9fe93eecad',1,'CAP_PROP_FRAME_WIDTH(Global Namespace)']]], + ['cap_5fprop_5fgain_269',['CAP_PROP_GAIN',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daf2ead561c823ccfbbd9889c8ac690b75',1,'cv::CAP_PROP_GAIN'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daf2ead561c823ccfbbd9889c8ac690b75',1,'CAP_PROP_GAIN(Global Namespace)']]], + ['cap_5fprop_5fgamma_270',['CAP_PROP_GAMMA',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da16f82a926e5e1003ed420e12b37753b1',1,'cv::CAP_PROP_GAMMA'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da16f82a926e5e1003ed420e12b37753b1',1,'CAP_PROP_GAMMA(Global Namespace)']]], + ['cap_5fprop_5fgiga_5fframe_5fheigh_5fmax_271',['CAP_PROP_GIGA_FRAME_HEIGH_MAX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fafa8cdf9c627d7264bf7f9d77e4a8437f',1,'cv::CAP_PROP_GIGA_FRAME_HEIGH_MAX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fafa8cdf9c627d7264bf7f9d77e4a8437f',1,'cv::CAP_PROP_GIGA_FRAME_HEIGH_MAX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fafa8cdf9c627d7264bf7f9d77e4a8437f',1,'CAP_PROP_GIGA_FRAME_HEIGH_MAX(Global Namespace)']]], + ['cap_5fprop_5fgiga_5fframe_5foffset_5fx_272',['CAP_PROP_GIGA_FRAME_OFFSET_X',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fae548de03f852996b9ba5e5adfbbbce93',1,'cv::CAP_PROP_GIGA_FRAME_OFFSET_X'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fae548de03f852996b9ba5e5adfbbbce93',1,'cv::CAP_PROP_GIGA_FRAME_OFFSET_X'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fae548de03f852996b9ba5e5adfbbbce93',1,'CAP_PROP_GIGA_FRAME_OFFSET_X(Global Namespace)']]], + ['cap_5fprop_5fgiga_5fframe_5foffset_5fy_273',['CAP_PROP_GIGA_FRAME_OFFSET_Y',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fafb8d98d9ad34d6d74bdbeff2f5197111',1,'cv::CAP_PROP_GIGA_FRAME_OFFSET_Y'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fafb8d98d9ad34d6d74bdbeff2f5197111',1,'cv::CAP_PROP_GIGA_FRAME_OFFSET_Y'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fafb8d98d9ad34d6d74bdbeff2f5197111',1,'CAP_PROP_GIGA_FRAME_OFFSET_Y(Global Namespace)']]], + ['cap_5fprop_5fgiga_5fframe_5fsens_5fheigh_274',['CAP_PROP_GIGA_FRAME_SENS_HEIGH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194faee1202dad37d4dd3f02f9fa42e149b23',1,'cv::CAP_PROP_GIGA_FRAME_SENS_HEIGH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194faee1202dad37d4dd3f02f9fa42e149b23',1,'cv::CAP_PROP_GIGA_FRAME_SENS_HEIGH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194faee1202dad37d4dd3f02f9fa42e149b23',1,'CAP_PROP_GIGA_FRAME_SENS_HEIGH(Global Namespace)']]], + ['cap_5fprop_5fgiga_5fframe_5fsens_5fwidth_275',['CAP_PROP_GIGA_FRAME_SENS_WIDTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fa9330b5353a86ba5dfc522859fb3ec8d9',1,'cv::CAP_PROP_GIGA_FRAME_SENS_WIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fa9330b5353a86ba5dfc522859fb3ec8d9',1,'cv::CAP_PROP_GIGA_FRAME_SENS_WIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194fa9330b5353a86ba5dfc522859fb3ec8d9',1,'CAP_PROP_GIGA_FRAME_SENS_WIDTH(Global Namespace)']]], + ['cap_5fprop_5fgiga_5fframe_5fwidth_5fmax_276',['CAP_PROP_GIGA_FRAME_WIDTH_MAX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194faa72a12bf66268d701e80113a2b7767fc',1,'cv::CAP_PROP_GIGA_FRAME_WIDTH_MAX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194faa72a12bf66268d701e80113a2b7767fc',1,'cv::CAP_PROP_GIGA_FRAME_WIDTH_MAX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac840a3d19500b9d5608513fba163194faa72a12bf66268d701e80113a2b7767fc',1,'CAP_PROP_GIGA_FRAME_WIDTH_MAX(Global Namespace)']]], + ['cap_5fprop_5fgphoto2_5fcollect_5fmsgs_277',['CAP_PROP_GPHOTO2_COLLECT_MSGS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daaa50f65192f6dd5970282ed6bea335731',1,'cv::CAP_PROP_GPHOTO2_COLLECT_MSGS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daaa50f65192f6dd5970282ed6bea335731',1,'cv::CAP_PROP_GPHOTO2_COLLECT_MSGS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daaa50f65192f6dd5970282ed6bea335731',1,'CAP_PROP_GPHOTO2_COLLECT_MSGS(Global Namespace)']]], + ['cap_5fprop_5fgphoto2_5fflush_5fmsgs_278',['CAP_PROP_GPHOTO2_FLUSH_MSGS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa12383f3e93113560c8f01d7abc8b1607',1,'cv::CAP_PROP_GPHOTO2_FLUSH_MSGS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa12383f3e93113560c8f01d7abc8b1607',1,'cv::CAP_PROP_GPHOTO2_FLUSH_MSGS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa12383f3e93113560c8f01d7abc8b1607',1,'CAP_PROP_GPHOTO2_FLUSH_MSGS(Global Namespace)']]], + ['cap_5fprop_5fgphoto2_5fpreview_279',['CAP_PROP_GPHOTO2_PREVIEW',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daad68866e163722ca095ebb063759201bd',1,'cv::CAP_PROP_GPHOTO2_PREVIEW'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daad68866e163722ca095ebb063759201bd',1,'cv::CAP_PROP_GPHOTO2_PREVIEW'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daad68866e163722ca095ebb063759201bd',1,'CAP_PROP_GPHOTO2_PREVIEW(Global Namespace)']]], + ['cap_5fprop_5fgphoto2_5freload_5fconfig_280',['CAP_PROP_GPHOTO2_RELOAD_CONFIG',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa842f6beebf68e379a6be441979709e07',1,'cv::CAP_PROP_GPHOTO2_RELOAD_CONFIG'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa842f6beebf68e379a6be441979709e07',1,'cv::CAP_PROP_GPHOTO2_RELOAD_CONFIG'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa842f6beebf68e379a6be441979709e07',1,'CAP_PROP_GPHOTO2_RELOAD_CONFIG(Global Namespace)']]], + ['cap_5fprop_5fgphoto2_5freload_5fon_5fchange_281',['CAP_PROP_GPHOTO2_RELOAD_ON_CHANGE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa794abce1a061930e32d362f4ec1dd9e9',1,'cv::CAP_PROP_GPHOTO2_RELOAD_ON_CHANGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa794abce1a061930e32d362f4ec1dd9e9',1,'cv::CAP_PROP_GPHOTO2_RELOAD_ON_CHANGE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daa794abce1a061930e32d362f4ec1dd9e9',1,'CAP_PROP_GPHOTO2_RELOAD_ON_CHANGE(Global Namespace)']]], + ['cap_5fprop_5fgphoto2_5fwidget_5fenumerate_282',['CAP_PROP_GPHOTO2_WIDGET_ENUMERATE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daad6f05f89311dc09cfaf828c8b91b6d18',1,'cv::CAP_PROP_GPHOTO2_WIDGET_ENUMERATE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daad6f05f89311dc09cfaf828c8b91b6d18',1,'cv::CAP_PROP_GPHOTO2_WIDGET_ENUMERATE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daad6f05f89311dc09cfaf828c8b91b6d18',1,'CAP_PROP_GPHOTO2_WIDGET_ENUMERATE(Global Namespace)']]], + ['cap_5fprop_5fgstreamer_5fqueue_5flength_283',['CAP_PROP_GSTREAMER_QUEUE_LENGTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga7879653f5149fe92a14bc0ba3430b9b4a15017e3dbe8d23bf4081b71d35e71bdf',1,'cv::CAP_PROP_GSTREAMER_QUEUE_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga7879653f5149fe92a14bc0ba3430b9b4a15017e3dbe8d23bf4081b71d35e71bdf',1,'cv::CAP_PROP_GSTREAMER_QUEUE_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga7879653f5149fe92a14bc0ba3430b9b4a15017e3dbe8d23bf4081b71d35e71bdf',1,'CAP_PROP_GSTREAMER_QUEUE_LENGTH(Global Namespace)']]], + ['cap_5fprop_5fguid_284',['CAP_PROP_GUID',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa33343b2bee43f96c3f8c4f4d809d040',1,'cv::CAP_PROP_GUID'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa33343b2bee43f96c3f8c4f4d809d040',1,'CAP_PROP_GUID(Global Namespace)']]], + ['cap_5fprop_5fhue_285',['CAP_PROP_HUE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa9800b2246d653480facbf02a3d1109b',1,'cv::CAP_PROP_HUE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa9800b2246d653480facbf02a3d1109b',1,'CAP_PROP_HUE(Global Namespace)']]], + ['cap_5fprop_5fimages_5fbase_286',['CAP_PROP_IMAGES_BASE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggad354fdd0fcc8202f7624903c065bef06afde4916d952c3a893b2dfb809f2b75e6',1,'cv::CAP_PROP_IMAGES_BASE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggad354fdd0fcc8202f7624903c065bef06afde4916d952c3a893b2dfb809f2b75e6',1,'cv::CAP_PROP_IMAGES_BASE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggad354fdd0fcc8202f7624903c065bef06afde4916d952c3a893b2dfb809f2b75e6',1,'CAP_PROP_IMAGES_BASE(Global Namespace)']]], + ['cap_5fprop_5fimages_5flast_287',['CAP_PROP_IMAGES_LAST',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggad354fdd0fcc8202f7624903c065bef06a419c7f8af9ed15c0b641b8c0201355c4',1,'cv::CAP_PROP_IMAGES_LAST'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggad354fdd0fcc8202f7624903c065bef06a419c7f8af9ed15c0b641b8c0201355c4',1,'cv::CAP_PROP_IMAGES_LAST'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggad354fdd0fcc8202f7624903c065bef06a419c7f8af9ed15c0b641b8c0201355c4',1,'CAP_PROP_IMAGES_LAST(Global Namespace)']]], + ['cap_5fprop_5fintelperc_5fdepth_5fconfidence_5fthreshold_288',['CAP_PROP_INTELPERC_DEPTH_CONFIDENCE_THRESHOLD',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765ac3f7024c4c8555f8927fa093aa31dd62',1,'cv::CAP_PROP_INTELPERC_DEPTH_CONFIDENCE_THRESHOLD'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765ac3f7024c4c8555f8927fa093aa31dd62',1,'cv::CAP_PROP_INTELPERC_DEPTH_CONFIDENCE_THRESHOLD'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765ac3f7024c4c8555f8927fa093aa31dd62',1,'CAP_PROP_INTELPERC_DEPTH_CONFIDENCE_THRESHOLD(Global Namespace)']]], + ['cap_5fprop_5fintelperc_5fdepth_5ffocal_5flength_5fhorz_289',['CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_HORZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a07423906d8a904f7997292878a5c78f0',1,'cv::CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_HORZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a07423906d8a904f7997292878a5c78f0',1,'cv::CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_HORZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a07423906d8a904f7997292878a5c78f0',1,'CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_HORZ(Global Namespace)']]], + ['cap_5fprop_5fintelperc_5fdepth_5ffocal_5flength_5fvert_290',['CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_VERT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a647281df465ac37cdc9e199f1fb9ca3c',1,'cv::CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_VERT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a647281df465ac37cdc9e199f1fb9ca3c',1,'cv::CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_VERT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a647281df465ac37cdc9e199f1fb9ca3c',1,'CAP_PROP_INTELPERC_DEPTH_FOCAL_LENGTH_VERT(Global Namespace)']]], + ['cap_5fprop_5fintelperc_5fdepth_5flow_5fconfidence_5fvalue_291',['CAP_PROP_INTELPERC_DEPTH_LOW_CONFIDENCE_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a0096091135b3fa213dbeed6a103d8b58',1,'cv::CAP_PROP_INTELPERC_DEPTH_LOW_CONFIDENCE_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a0096091135b3fa213dbeed6a103d8b58',1,'cv::CAP_PROP_INTELPERC_DEPTH_LOW_CONFIDENCE_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a0096091135b3fa213dbeed6a103d8b58',1,'CAP_PROP_INTELPERC_DEPTH_LOW_CONFIDENCE_VALUE(Global Namespace)']]], + ['cap_5fprop_5fintelperc_5fdepth_5fsaturation_5fvalue_292',['CAP_PROP_INTELPERC_DEPTH_SATURATION_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765acc9291ae9c5beec367fb701cabcaaf0e',1,'cv::CAP_PROP_INTELPERC_DEPTH_SATURATION_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765acc9291ae9c5beec367fb701cabcaaf0e',1,'cv::CAP_PROP_INTELPERC_DEPTH_SATURATION_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765acc9291ae9c5beec367fb701cabcaaf0e',1,'CAP_PROP_INTELPERC_DEPTH_SATURATION_VALUE(Global Namespace)']]], + ['cap_5fprop_5fintelperc_5fprofile_5fcount_293',['CAP_PROP_INTELPERC_PROFILE_COUNT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a61e601c701375c5e43d43754ddf6d030',1,'cv::CAP_PROP_INTELPERC_PROFILE_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a61e601c701375c5e43d43754ddf6d030',1,'cv::CAP_PROP_INTELPERC_PROFILE_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a61e601c701375c5e43d43754ddf6d030',1,'CAP_PROP_INTELPERC_PROFILE_COUNT(Global Namespace)']]], + ['cap_5fprop_5fintelperc_5fprofile_5fidx_294',['CAP_PROP_INTELPERC_PROFILE_IDX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a03489c9c3fc5b2656a9063f2e079d7a3',1,'cv::CAP_PROP_INTELPERC_PROFILE_IDX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a03489c9c3fc5b2656a9063f2e079d7a3',1,'cv::CAP_PROP_INTELPERC_PROFILE_IDX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga92d4fefd20686e23012183c724374765a03489c9c3fc5b2656a9063f2e079d7a3',1,'CAP_PROP_INTELPERC_PROFILE_IDX(Global Namespace)']]], + ['cap_5fprop_5fios_5fdevice_5fexposure_295',['CAP_PROP_IOS_DEVICE_EXPOSURE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927aea912356d2f5707561b5a7d44e11fa00',1,'cv::CAP_PROP_IOS_DEVICE_EXPOSURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927aea912356d2f5707561b5a7d44e11fa00',1,'cv::CAP_PROP_IOS_DEVICE_EXPOSURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927aea912356d2f5707561b5a7d44e11fa00',1,'CAP_PROP_IOS_DEVICE_EXPOSURE(Global Namespace)']]], + ['cap_5fprop_5fios_5fdevice_5fflash_296',['CAP_PROP_IOS_DEVICE_FLASH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a7d18d0bbcc2094dd9cc8214afa52f70a',1,'cv::CAP_PROP_IOS_DEVICE_FLASH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a7d18d0bbcc2094dd9cc8214afa52f70a',1,'cv::CAP_PROP_IOS_DEVICE_FLASH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a7d18d0bbcc2094dd9cc8214afa52f70a',1,'CAP_PROP_IOS_DEVICE_FLASH(Global Namespace)']]], + ['cap_5fprop_5fios_5fdevice_5ffocus_297',['CAP_PROP_IOS_DEVICE_FOCUS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a049085d744de6023c0b4b263e16ce9ff',1,'cv::CAP_PROP_IOS_DEVICE_FOCUS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a049085d744de6023c0b4b263e16ce9ff',1,'cv::CAP_PROP_IOS_DEVICE_FOCUS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a049085d744de6023c0b4b263e16ce9ff',1,'CAP_PROP_IOS_DEVICE_FOCUS(Global Namespace)']]], + ['cap_5fprop_5fios_5fdevice_5ftorch_298',['CAP_PROP_IOS_DEVICE_TORCH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a0f5c7fcd82d2eb877eb299419caf7ac6',1,'cv::CAP_PROP_IOS_DEVICE_TORCH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a0f5c7fcd82d2eb877eb299419caf7ac6',1,'cv::CAP_PROP_IOS_DEVICE_TORCH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a0f5c7fcd82d2eb877eb299419caf7ac6',1,'CAP_PROP_IOS_DEVICE_TORCH(Global Namespace)']]], + ['cap_5fprop_5fios_5fdevice_5fwhitebalance_299',['CAP_PROP_IOS_DEVICE_WHITEBALANCE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a709a5efd2ef0842ba866c494c844e784',1,'cv::CAP_PROP_IOS_DEVICE_WHITEBALANCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a709a5efd2ef0842ba866c494c844e784',1,'cv::CAP_PROP_IOS_DEVICE_WHITEBALANCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga64299f9f4e4da0dd0fda5a2fff388927a709a5efd2ef0842ba866c494c844e784',1,'CAP_PROP_IOS_DEVICE_WHITEBALANCE(Global Namespace)']]], + ['cap_5fprop_5firis_300',['CAP_PROP_IRIS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6fad0580db4515df0b5f5e4b05ee94fc',1,'cv::CAP_PROP_IRIS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6fad0580db4515df0b5f5e4b05ee94fc',1,'CAP_PROP_IRIS(Global Namespace)']]], + ['cap_5fprop_5fiso_5fspeed_301',['CAP_PROP_ISO_SPEED',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6f7abc33bd385769da80a33926445f9e',1,'cv::CAP_PROP_ISO_SPEED'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6f7abc33bd385769da80a33926445f9e',1,'CAP_PROP_ISO_SPEED(Global Namespace)']]], + ['cap_5fprop_5fmode_302',['CAP_PROP_MODE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dae45a994f35020bf149050dcb2a02da72',1,'cv::CAP_PROP_MODE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dae45a994f35020bf149050dcb2a02da72',1,'CAP_PROP_MODE(Global Namespace)']]], + ['cap_5fprop_5fmonochrome_303',['CAP_PROP_MONOCHROME',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dab48ba74e66e91d91722e036b322fb2a3',1,'cv::CAP_PROP_MONOCHROME'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dab48ba74e66e91d91722e036b322fb2a3',1,'CAP_PROP_MONOCHROME(Global Namespace)']]], + ['cap_5fprop_5fopenni2_5fmirror_304',['CAP_PROP_OPENNI2_MIRROR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba4d176582d7510d1dd24816916134178f',1,'cv::CAP_PROP_OPENNI2_MIRROR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba4d176582d7510d1dd24816916134178f',1,'cv::CAP_PROP_OPENNI2_MIRROR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba4d176582d7510d1dd24816916134178f',1,'CAP_PROP_OPENNI2_MIRROR(Global Namespace)']]], + ['cap_5fprop_5fopenni2_5fsync_305',['CAP_PROP_OPENNI2_SYNC',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaa3b67d0d527dde2b44abb117eee5f289',1,'cv::CAP_PROP_OPENNI2_SYNC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaa3b67d0d527dde2b44abb117eee5f289',1,'cv::CAP_PROP_OPENNI2_SYNC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaa3b67d0d527dde2b44abb117eee5f289',1,'CAP_PROP_OPENNI2_SYNC(Global Namespace)']]], + ['cap_5fprop_5fopenni_5fapprox_5fframe_5fsync_306',['CAP_PROP_OPENNI_APPROX_FRAME_SYNC',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaf675327cdfd8a83dd87d8e90b34479bb',1,'cv::CAP_PROP_OPENNI_APPROX_FRAME_SYNC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaf675327cdfd8a83dd87d8e90b34479bb',1,'cv::CAP_PROP_OPENNI_APPROX_FRAME_SYNC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaf675327cdfd8a83dd87d8e90b34479bb',1,'CAP_PROP_OPENNI_APPROX_FRAME_SYNC(Global Namespace)']]], + ['cap_5fprop_5fopenni_5fbaseline_307',['CAP_PROP_OPENNI_BASELINE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba676d008cfa53522d7d118d34ff66336b',1,'cv::CAP_PROP_OPENNI_BASELINE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba676d008cfa53522d7d118d34ff66336b',1,'cv::CAP_PROP_OPENNI_BASELINE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba676d008cfa53522d7d118d34ff66336b',1,'CAP_PROP_OPENNI_BASELINE(Global Namespace)']]], + ['cap_5fprop_5fopenni_5fcircle_5fbuffer_308',['CAP_PROP_OPENNI_CIRCLE_BUFFER',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba580f8871db885f3dc6bdfcc0abcef9a8',1,'cv::CAP_PROP_OPENNI_CIRCLE_BUFFER'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba580f8871db885f3dc6bdfcc0abcef9a8',1,'cv::CAP_PROP_OPENNI_CIRCLE_BUFFER'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba580f8871db885f3dc6bdfcc0abcef9a8',1,'CAP_PROP_OPENNI_CIRCLE_BUFFER(Global Namespace)']]], + ['cap_5fprop_5fopenni_5ffocal_5flength_309',['CAP_PROP_OPENNI_FOCAL_LENGTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba8103ade90d890b2b0a9d0cef99e59dc1',1,'cv::CAP_PROP_OPENNI_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba8103ade90d890b2b0a9d0cef99e59dc1',1,'cv::CAP_PROP_OPENNI_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba8103ade90d890b2b0a9d0cef99e59dc1',1,'CAP_PROP_OPENNI_FOCAL_LENGTH(Global Namespace)']]], + ['cap_5fprop_5fopenni_5fframe_5fmax_5fdepth_310',['CAP_PROP_OPENNI_FRAME_MAX_DEPTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaf1babc6cc545ca6774f1690b9c32a036',1,'cv::CAP_PROP_OPENNI_FRAME_MAX_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaf1babc6cc545ca6774f1690b9c32a036',1,'cv::CAP_PROP_OPENNI_FRAME_MAX_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaf1babc6cc545ca6774f1690b9c32a036',1,'CAP_PROP_OPENNI_FRAME_MAX_DEPTH(Global Namespace)']]], + ['cap_5fprop_5fopenni_5fgenerator_5fpresent_311',['CAP_PROP_OPENNI_GENERATOR_PRESENT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaa821a4784e36e4f40aa9e212537851e8',1,'cv::CAP_PROP_OPENNI_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaa821a4784e36e4f40aa9e212537851e8',1,'cv::CAP_PROP_OPENNI_GENERATOR_PRESENT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbaa821a4784e36e4f40aa9e212537851e8',1,'CAP_PROP_OPENNI_GENERATOR_PRESENT(Global Namespace)']]], + ['cap_5fprop_5fopenni_5fmax_5fbuffer_5fsize_312',['CAP_PROP_OPENNI_MAX_BUFFER_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba1512aa312e7db87684e323e7b440f63c',1,'cv::CAP_PROP_OPENNI_MAX_BUFFER_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba1512aa312e7db87684e323e7b440f63c',1,'cv::CAP_PROP_OPENNI_MAX_BUFFER_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba1512aa312e7db87684e323e7b440f63c',1,'CAP_PROP_OPENNI_MAX_BUFFER_SIZE(Global Namespace)']]], + ['cap_5fprop_5fopenni_5fmax_5ftime_5fduration_313',['CAP_PROP_OPENNI_MAX_TIME_DURATION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba0d36810d3a75e7d53292b2307b873ff6',1,'cv::CAP_PROP_OPENNI_MAX_TIME_DURATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba0d36810d3a75e7d53292b2307b873ff6',1,'cv::CAP_PROP_OPENNI_MAX_TIME_DURATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba0d36810d3a75e7d53292b2307b873ff6',1,'CAP_PROP_OPENNI_MAX_TIME_DURATION(Global Namespace)']]], + ['cap_5fprop_5fopenni_5foutput_5fmode_314',['CAP_PROP_OPENNI_OUTPUT_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbabcda142aeb58988856fe78d762e66de4',1,'cv::CAP_PROP_OPENNI_OUTPUT_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbabcda142aeb58988856fe78d762e66de4',1,'cv::CAP_PROP_OPENNI_OUTPUT_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bbabcda142aeb58988856fe78d762e66de4',1,'CAP_PROP_OPENNI_OUTPUT_MODE(Global Namespace)']]], + ['cap_5fprop_5fopenni_5fregistration_315',['CAP_PROP_OPENNI_REGISTRATION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba051eab1e624d79b5b3b297883eaab23f',1,'cv::CAP_PROP_OPENNI_REGISTRATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba051eab1e624d79b5b3b297883eaab23f',1,'cv::CAP_PROP_OPENNI_REGISTRATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba051eab1e624d79b5b3b297883eaab23f',1,'CAP_PROP_OPENNI_REGISTRATION(Global Namespace)']]], + ['cap_5fprop_5fopenni_5fregistration_5fon_316',['CAP_PROP_OPENNI_REGISTRATION_ON',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba66af01b2664b79aa76689ade0935736e',1,'cv::CAP_PROP_OPENNI_REGISTRATION_ON'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba66af01b2664b79aa76689ade0935736e',1,'cv::CAP_PROP_OPENNI_REGISTRATION_ON'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga694b077e6f87a82639f9e77fa950a6bba66af01b2664b79aa76689ade0935736e',1,'CAP_PROP_OPENNI_REGISTRATION_ON(Global Namespace)']]], + ['cap_5fprop_5fpan_317',['CAP_PROP_PAN',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da976bd262a1efb96781c9a675dd461d5e',1,'cv::CAP_PROP_PAN'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da976bd262a1efb96781c9a675dd461d5e',1,'CAP_PROP_PAN(Global Namespace)']]], + ['cap_5fprop_5fpos_5favi_5fratio_318',['CAP_PROP_POS_AVI_RATIO',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da7b235a04f50a444bc2dc72f5ae394aaf',1,'cv::CAP_PROP_POS_AVI_RATIO'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da7b235a04f50a444bc2dc72f5ae394aaf',1,'CAP_PROP_POS_AVI_RATIO(Global Namespace)']]], + ['cap_5fprop_5fpos_5fframes_319',['CAP_PROP_POS_FRAMES',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6223452891755166a4fd5173ea257068',1,'cv::CAP_PROP_POS_FRAMES'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6223452891755166a4fd5173ea257068',1,'CAP_PROP_POS_FRAMES(Global Namespace)']]], + ['cap_5fprop_5fpos_5fmsec_320',['CAP_PROP_POS_MSEC',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da7c2fa550ba270713fca1405397b90ae0',1,'cv::CAP_PROP_POS_MSEC'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da7c2fa550ba270713fca1405397b90ae0',1,'CAP_PROP_POS_MSEC(Global Namespace)']]], + ['cap_5fprop_5fpvapi_5fbinningx_321',['CAP_PROP_PVAPI_BINNINGX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175adc35a809d39b76611bbddfbe1d262de9',1,'cv::CAP_PROP_PVAPI_BINNINGX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175adc35a809d39b76611bbddfbe1d262de9',1,'cv::CAP_PROP_PVAPI_BINNINGX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175adc35a809d39b76611bbddfbe1d262de9',1,'CAP_PROP_PVAPI_BINNINGX(Global Namespace)']]], + ['cap_5fprop_5fpvapi_5fbinningy_322',['CAP_PROP_PVAPI_BINNINGY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175ad09164e443627dd9fffae73c17e26ff5',1,'cv::CAP_PROP_PVAPI_BINNINGY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175ad09164e443627dd9fffae73c17e26ff5',1,'cv::CAP_PROP_PVAPI_BINNINGY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175ad09164e443627dd9fffae73c17e26ff5',1,'CAP_PROP_PVAPI_BINNINGY(Global Namespace)']]], + ['cap_5fprop_5fpvapi_5fdecimationhorizontal_323',['CAP_PROP_PVAPI_DECIMATIONHORIZONTAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175ad10d97cf35c6cdba377ba9ed7f4df457',1,'cv::CAP_PROP_PVAPI_DECIMATIONHORIZONTAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175ad10d97cf35c6cdba377ba9ed7f4df457',1,'cv::CAP_PROP_PVAPI_DECIMATIONHORIZONTAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175ad10d97cf35c6cdba377ba9ed7f4df457',1,'CAP_PROP_PVAPI_DECIMATIONHORIZONTAL(Global Namespace)']]], + ['cap_5fprop_5fpvapi_5fdecimationvertical_324',['CAP_PROP_PVAPI_DECIMATIONVERTICAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a15037da6569b943b91364be21af58ede',1,'cv::CAP_PROP_PVAPI_DECIMATIONVERTICAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a15037da6569b943b91364be21af58ede',1,'cv::CAP_PROP_PVAPI_DECIMATIONVERTICAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a15037da6569b943b91364be21af58ede',1,'CAP_PROP_PVAPI_DECIMATIONVERTICAL(Global Namespace)']]], + ['cap_5fprop_5fpvapi_5fframestarttriggermode_325',['CAP_PROP_PVAPI_FRAMESTARTTRIGGERMODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a337f6f1806a65c7e9b4bf33f96b46008',1,'cv::CAP_PROP_PVAPI_FRAMESTARTTRIGGERMODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a337f6f1806a65c7e9b4bf33f96b46008',1,'cv::CAP_PROP_PVAPI_FRAMESTARTTRIGGERMODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a337f6f1806a65c7e9b4bf33f96b46008',1,'CAP_PROP_PVAPI_FRAMESTARTTRIGGERMODE(Global Namespace)']]], + ['cap_5fprop_5fpvapi_5fmulticastip_326',['CAP_PROP_PVAPI_MULTICASTIP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a4c1e342f7800bb32f5994170c71b107b',1,'cv::CAP_PROP_PVAPI_MULTICASTIP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a4c1e342f7800bb32f5994170c71b107b',1,'cv::CAP_PROP_PVAPI_MULTICASTIP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175a4c1e342f7800bb32f5994170c71b107b',1,'CAP_PROP_PVAPI_MULTICASTIP(Global Namespace)']]], + ['cap_5fprop_5fpvapi_5fpixelformat_327',['CAP_PROP_PVAPI_PIXELFORMAT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175af398d565fa74a15b5336cd7d7b4875c1',1,'cv::CAP_PROP_PVAPI_PIXELFORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175af398d565fa74a15b5336cd7d7b4875c1',1,'cv::CAP_PROP_PVAPI_PIXELFORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac661bcd604165a7945664ef634af2175af398d565fa74a15b5336cd7d7b4875c1',1,'CAP_PROP_PVAPI_PIXELFORMAT(Global Namespace)']]], + ['cap_5fprop_5frectification_328',['CAP_PROP_RECTIFICATION',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da0471d0b2b6fe06f6977a41bbe56b46b5',1,'cv::CAP_PROP_RECTIFICATION'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da0471d0b2b6fe06f6977a41bbe56b46b5',1,'CAP_PROP_RECTIFICATION(Global Namespace)']]], + ['cap_5fprop_5froll_329',['CAP_PROP_ROLL',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dab8ccf2e54a73af3d0f1249cbc9c21445',1,'cv::CAP_PROP_ROLL'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dab8ccf2e54a73af3d0f1249cbc9c21445',1,'CAP_PROP_ROLL(Global Namespace)']]], + ['cap_5fprop_5fsar_5fden_330',['CAP_PROP_SAR_DEN',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daaac79210a04c7a75815be9dfbf78eaf1',1,'cv::CAP_PROP_SAR_DEN'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daaac79210a04c7a75815be9dfbf78eaf1',1,'CAP_PROP_SAR_DEN(Global Namespace)']]], + ['cap_5fprop_5fsar_5fnum_331',['CAP_PROP_SAR_NUM',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da4fc3ef1222d9a8be3d7b6d044494a523',1,'cv::CAP_PROP_SAR_NUM'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da4fc3ef1222d9a8be3d7b6d044494a523',1,'CAP_PROP_SAR_NUM(Global Namespace)']]], + ['cap_5fprop_5fsaturation_332',['CAP_PROP_SATURATION',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da2495072c1b81de961e5b9f601bc4aab3',1,'cv::CAP_PROP_SATURATION'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da2495072c1b81de961e5b9f601bc4aab3',1,'CAP_PROP_SATURATION(Global Namespace)']]], + ['cap_5fprop_5fsettings_333',['CAP_PROP_SETTINGS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6339d098548d91f438b6f10ee1407c72',1,'cv::CAP_PROP_SETTINGS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da6339d098548d91f438b6f10ee1407c72',1,'CAP_PROP_SETTINGS(Global Namespace)']]], + ['cap_5fprop_5fsharpness_334',['CAP_PROP_SHARPNESS',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa4cff86666811a91654c34ea05eef368',1,'cv::CAP_PROP_SHARPNESS'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa4cff86666811a91654c34ea05eef368',1,'CAP_PROP_SHARPNESS(Global Namespace)']]], + ['cap_5fprop_5fspeed_335',['CAP_PROP_SPEED',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daae9be75bcff2e935ddae1f5b09941c462',1,'cv::CAP_PROP_SPEED'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daae9be75bcff2e935ddae1f5b09941c462',1,'cv::CAP_PROP_SPEED'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daae9be75bcff2e935ddae1f5b09941c462',1,'CAP_PROP_SPEED(Global Namespace)']]], + ['cap_5fprop_5ftemperature_336',['CAP_PROP_TEMPERATURE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da4471c47a983494d88844aa313e599a5f',1,'cv::CAP_PROP_TEMPERATURE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da4471c47a983494d88844aa313e599a5f',1,'CAP_PROP_TEMPERATURE(Global Namespace)']]], + ['cap_5fprop_5ftilt_337',['CAP_PROP_TILT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad126234b7a8bd92a50fc075461a99778',1,'cv::CAP_PROP_TILT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dad126234b7a8bd92a50fc075461a99778',1,'CAP_PROP_TILT(Global Namespace)']]], + ['cap_5fprop_5ftrigger_338',['CAP_PROP_TRIGGER',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa157bb0c323279596cbed43a8d8d7827',1,'cv::CAP_PROP_TRIGGER'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704daa157bb0c323279596cbed43a8d8d7827',1,'CAP_PROP_TRIGGER(Global Namespace)']]], + ['cap_5fprop_5ftrigger_5fdelay_339',['CAP_PROP_TRIGGER_DELAY',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da97bdb876e58d2b5e0b6958a1cc195eac',1,'cv::CAP_PROP_TRIGGER_DELAY'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da97bdb876e58d2b5e0b6958a1cc195eac',1,'CAP_PROP_TRIGGER_DELAY(Global Namespace)']]], + ['cap_5fprop_5fviewfinder_340',['CAP_PROP_VIEWFINDER',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daabe08426b291b533a4cf61a7e4e7d1324',1,'cv::CAP_PROP_VIEWFINDER'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daabe08426b291b533a4cf61a7e4e7d1324',1,'cv::CAP_PROP_VIEWFINDER'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6ff34ec31356df0b3cef388a831bf4daabe08426b291b533a4cf61a7e4e7d1324',1,'CAP_PROP_VIEWFINDER(Global Namespace)']]], + ['cap_5fprop_5fwb_5ftemperature_341',['CAP_PROP_WB_TEMPERATURE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da280eb4a13368f5ccdea3b2233dbc25b6',1,'cv::CAP_PROP_WB_TEMPERATURE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da280eb4a13368f5ccdea3b2233dbc25b6',1,'CAP_PROP_WB_TEMPERATURE(Global Namespace)']]], + ['cap_5fprop_5fwhite_5fbalance_5fblue_5fu_342',['CAP_PROP_WHITE_BALANCE_BLUE_U',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dafe7719e51138b49c8fd9c7c71d5121a9',1,'cv::CAP_PROP_WHITE_BALANCE_BLUE_U'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704dafe7719e51138b49c8fd9c7c71d5121a9',1,'CAP_PROP_WHITE_BALANCE_BLUE_U(Global Namespace)']]], + ['cap_5fprop_5fwhite_5fbalance_5fred_5fv_343',['CAP_PROP_WHITE_BALANCE_RED_V',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da4da437eb05a5af70b080254027acc5e0',1,'cv::CAP_PROP_WHITE_BALANCE_RED_V'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da4da437eb05a5af70b080254027acc5e0',1,'CAP_PROP_WHITE_BALANCE_RED_V(Global Namespace)']]], + ['cap_5fprop_5fxi_5facq_5fbuffer_5fsize_344',['CAP_PROP_XI_ACQ_BUFFER_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa29dd84cf215e0f439a66fe868455cdd',1,'cv::CAP_PROP_XI_ACQ_BUFFER_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa29dd84cf215e0f439a66fe868455cdd',1,'cv::CAP_PROP_XI_ACQ_BUFFER_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa29dd84cf215e0f439a66fe868455cdd',1,'CAP_PROP_XI_ACQ_BUFFER_SIZE(Global Namespace)']]], + ['cap_5fprop_5fxi_5facq_5fbuffer_5fsize_5funit_345',['CAP_PROP_XI_ACQ_BUFFER_SIZE_UNIT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca541d2ca1825e3fbdf0e850558e82b242',1,'cv::CAP_PROP_XI_ACQ_BUFFER_SIZE_UNIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca541d2ca1825e3fbdf0e850558e82b242',1,'cv::CAP_PROP_XI_ACQ_BUFFER_SIZE_UNIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca541d2ca1825e3fbdf0e850558e82b242',1,'CAP_PROP_XI_ACQ_BUFFER_SIZE_UNIT(Global Namespace)']]], + ['cap_5fprop_5fxi_5facq_5fframe_5fburst_5fcount_346',['CAP_PROP_XI_ACQ_FRAME_BURST_COUNT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca74fe2c1fa26066f63ceb698fd24e1b24',1,'cv::CAP_PROP_XI_ACQ_FRAME_BURST_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca74fe2c1fa26066f63ceb698fd24e1b24',1,'cv::CAP_PROP_XI_ACQ_FRAME_BURST_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca74fe2c1fa26066f63ceb698fd24e1b24',1,'CAP_PROP_XI_ACQ_FRAME_BURST_COUNT(Global Namespace)']]], + ['cap_5fprop_5fxi_5facq_5ftiming_5fmode_347',['CAP_PROP_XI_ACQ_TIMING_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabfc1c4c1d54741960f234e782d5be2af',1,'cv::CAP_PROP_XI_ACQ_TIMING_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabfc1c4c1d54741960f234e782d5be2af',1,'cv::CAP_PROP_XI_ACQ_TIMING_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabfc1c4c1d54741960f234e782d5be2af',1,'CAP_PROP_XI_ACQ_TIMING_MODE(Global Namespace)']]], + ['cap_5fprop_5fxi_5facq_5ftransport_5fbuffer_5fcommit_348',['CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_COMMIT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca898f4934777168695360effbefd4b3e7',1,'cv::CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_COMMIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca898f4934777168695360effbefd4b3e7',1,'cv::CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_COMMIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca898f4934777168695360effbefd4b3e7',1,'CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_COMMIT(Global Namespace)']]], + ['cap_5fprop_5fxi_5facq_5ftransport_5fbuffer_5fsize_349',['CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac93e79a0df6b8383b383d0c3e377e832',1,'cv::CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac93e79a0df6b8383b383d0c3e377e832',1,'cv::CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac93e79a0df6b8383b383d0c3e377e832',1,'CAP_PROP_XI_ACQ_TRANSPORT_BUFFER_SIZE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fae_5fmax_5flimit_350',['CAP_PROP_XI_AE_MAX_LIMIT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaab0ce44b1aa17d4f82678aeebcd1deb5',1,'cv::CAP_PROP_XI_AE_MAX_LIMIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaab0ce44b1aa17d4f82678aeebcd1deb5',1,'cv::CAP_PROP_XI_AE_MAX_LIMIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaab0ce44b1aa17d4f82678aeebcd1deb5',1,'CAP_PROP_XI_AE_MAX_LIMIT(Global Namespace)']]], + ['cap_5fprop_5fxi_5faeag_351',['CAP_PROP_XI_AEAG',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9eb8e60a7c1ec79d620d194f2bb3deba',1,'cv::CAP_PROP_XI_AEAG'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9eb8e60a7c1ec79d620d194f2bb3deba',1,'cv::CAP_PROP_XI_AEAG'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9eb8e60a7c1ec79d620d194f2bb3deba',1,'CAP_PROP_XI_AEAG(Global Namespace)']]], + ['cap_5fprop_5fxi_5faeag_5flevel_352',['CAP_PROP_XI_AEAG_LEVEL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1df2a23c5ac1d3b0e690d634a23f3815',1,'cv::CAP_PROP_XI_AEAG_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1df2a23c5ac1d3b0e690d634a23f3815',1,'cv::CAP_PROP_XI_AEAG_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1df2a23c5ac1d3b0e690d634a23f3815',1,'CAP_PROP_XI_AEAG_LEVEL(Global Namespace)']]], + ['cap_5fprop_5fxi_5faeag_5froi_5fheight_353',['CAP_PROP_XI_AEAG_ROI_HEIGHT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaef5ce8e8556233335e9771c5a13cf646',1,'cv::CAP_PROP_XI_AEAG_ROI_HEIGHT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaef5ce8e8556233335e9771c5a13cf646',1,'cv::CAP_PROP_XI_AEAG_ROI_HEIGHT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaef5ce8e8556233335e9771c5a13cf646',1,'CAP_PROP_XI_AEAG_ROI_HEIGHT(Global Namespace)']]], + ['cap_5fprop_5fxi_5faeag_5froi_5foffset_5fx_354',['CAP_PROP_XI_AEAG_ROI_OFFSET_X',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca39e41c91baf6f63c17af16eca11854f8',1,'cv::CAP_PROP_XI_AEAG_ROI_OFFSET_X'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca39e41c91baf6f63c17af16eca11854f8',1,'cv::CAP_PROP_XI_AEAG_ROI_OFFSET_X'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca39e41c91baf6f63c17af16eca11854f8',1,'CAP_PROP_XI_AEAG_ROI_OFFSET_X(Global Namespace)']]], + ['cap_5fprop_5fxi_5faeag_5froi_5foffset_5fy_355',['CAP_PROP_XI_AEAG_ROI_OFFSET_Y',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca46b7791d22180493c94beef20d98fe94',1,'cv::CAP_PROP_XI_AEAG_ROI_OFFSET_Y'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca46b7791d22180493c94beef20d98fe94',1,'cv::CAP_PROP_XI_AEAG_ROI_OFFSET_Y'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca46b7791d22180493c94beef20d98fe94',1,'CAP_PROP_XI_AEAG_ROI_OFFSET_Y(Global Namespace)']]], + ['cap_5fprop_5fxi_5faeag_5froi_5fwidth_356',['CAP_PROP_XI_AEAG_ROI_WIDTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacbd2426abe20e582a878d7621951bf1a',1,'cv::CAP_PROP_XI_AEAG_ROI_WIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacbd2426abe20e582a878d7621951bf1a',1,'cv::CAP_PROP_XI_AEAG_ROI_WIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacbd2426abe20e582a878d7621951bf1a',1,'CAP_PROP_XI_AEAG_ROI_WIDTH(Global Namespace)']]], + ['cap_5fprop_5fxi_5fag_5fmax_5flimit_357',['CAP_PROP_XI_AG_MAX_LIMIT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8d1beac67e7dffae82f72b9a91922e02',1,'cv::CAP_PROP_XI_AG_MAX_LIMIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8d1beac67e7dffae82f72b9a91922e02',1,'cv::CAP_PROP_XI_AG_MAX_LIMIT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8d1beac67e7dffae82f72b9a91922e02',1,'CAP_PROP_XI_AG_MAX_LIMIT(Global Namespace)']]], + ['cap_5fprop_5fxi_5fapply_5fcms_358',['CAP_PROP_XI_APPLY_CMS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab5f0a4155a300bd53ee69539a405fe41',1,'cv::CAP_PROP_XI_APPLY_CMS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab5f0a4155a300bd53ee69539a405fe41',1,'cv::CAP_PROP_XI_APPLY_CMS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab5f0a4155a300bd53ee69539a405fe41',1,'CAP_PROP_XI_APPLY_CMS(Global Namespace)']]], + ['cap_5fprop_5fxi_5fauto_5fbandwidth_5fcalculation_359',['CAP_PROP_XI_AUTO_BANDWIDTH_CALCULATION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac689b604605532a1e1b4da825b4b8315',1,'cv::CAP_PROP_XI_AUTO_BANDWIDTH_CALCULATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac689b604605532a1e1b4da825b4b8315',1,'cv::CAP_PROP_XI_AUTO_BANDWIDTH_CALCULATION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac689b604605532a1e1b4da825b4b8315',1,'CAP_PROP_XI_AUTO_BANDWIDTH_CALCULATION(Global Namespace)']]], + ['cap_5fprop_5fxi_5fauto_5fwb_360',['CAP_PROP_XI_AUTO_WB',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca78726921e8b31b899e12e1b7aa7acc0b',1,'cv::CAP_PROP_XI_AUTO_WB'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca78726921e8b31b899e12e1b7aa7acc0b',1,'cv::CAP_PROP_XI_AUTO_WB'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca78726921e8b31b899e12e1b7aa7acc0b',1,'CAP_PROP_XI_AUTO_WB(Global Namespace)']]], + ['cap_5fprop_5fxi_5favailable_5fbandwidth_361',['CAP_PROP_XI_AVAILABLE_BANDWIDTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca93c8b6cca33f3a341502e1f05471e980',1,'cv::CAP_PROP_XI_AVAILABLE_BANDWIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca93c8b6cca33f3a341502e1f05471e980',1,'cv::CAP_PROP_XI_AVAILABLE_BANDWIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca93c8b6cca33f3a341502e1f05471e980',1,'CAP_PROP_XI_AVAILABLE_BANDWIDTH(Global Namespace)']]], + ['cap_5fprop_5fxi_5fbinning_5fhorizontal_362',['CAP_PROP_XI_BINNING_HORIZONTAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8ad99a5e916acc75fcc7721feb34a317',1,'cv::CAP_PROP_XI_BINNING_HORIZONTAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8ad99a5e916acc75fcc7721feb34a317',1,'cv::CAP_PROP_XI_BINNING_HORIZONTAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8ad99a5e916acc75fcc7721feb34a317',1,'CAP_PROP_XI_BINNING_HORIZONTAL(Global Namespace)']]], + ['cap_5fprop_5fxi_5fbinning_5fpattern_363',['CAP_PROP_XI_BINNING_PATTERN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab06c8c58619c511dac584a2f75e3d7ad',1,'cv::CAP_PROP_XI_BINNING_PATTERN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab06c8c58619c511dac584a2f75e3d7ad',1,'cv::CAP_PROP_XI_BINNING_PATTERN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab06c8c58619c511dac584a2f75e3d7ad',1,'CAP_PROP_XI_BINNING_PATTERN(Global Namespace)']]], + ['cap_5fprop_5fxi_5fbinning_5fselector_364',['CAP_PROP_XI_BINNING_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca13057f6fa93855d14425fccd23bb83ec',1,'cv::CAP_PROP_XI_BINNING_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca13057f6fa93855d14425fccd23bb83ec',1,'cv::CAP_PROP_XI_BINNING_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca13057f6fa93855d14425fccd23bb83ec',1,'CAP_PROP_XI_BINNING_SELECTOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5fbinning_5fvertical_365',['CAP_PROP_XI_BINNING_VERTICAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0199f71e8c1c122580bca052ec01f985',1,'cv::CAP_PROP_XI_BINNING_VERTICAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0199f71e8c1c122580bca052ec01f985',1,'cv::CAP_PROP_XI_BINNING_VERTICAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0199f71e8c1c122580bca052ec01f985',1,'CAP_PROP_XI_BINNING_VERTICAL(Global Namespace)']]], + ['cap_5fprop_5fxi_5fbpc_366',['CAP_PROP_XI_BPC',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8e96da9798b9d04931b78f161d860068',1,'cv::CAP_PROP_XI_BPC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8e96da9798b9d04931b78f161d860068',1,'cv::CAP_PROP_XI_BPC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8e96da9798b9d04931b78f161d860068',1,'CAP_PROP_XI_BPC(Global Namespace)']]], + ['cap_5fprop_5fxi_5fbuffer_5fpolicy_367',['CAP_PROP_XI_BUFFER_POLICY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca928df33def77f34c5c7f311858f25c48',1,'cv::CAP_PROP_XI_BUFFER_POLICY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca928df33def77f34c5c7f311858f25c48',1,'cv::CAP_PROP_XI_BUFFER_POLICY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca928df33def77f34c5c7f311858f25c48',1,'CAP_PROP_XI_BUFFER_POLICY(Global Namespace)']]], + ['cap_5fprop_5fxi_5fbuffers_5fqueue_5fsize_368',['CAP_PROP_XI_BUFFERS_QUEUE_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca656141833befd21f204c7d9f7687b9cf',1,'cv::CAP_PROP_XI_BUFFERS_QUEUE_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca656141833befd21f204c7d9f7687b9cf',1,'cv::CAP_PROP_XI_BUFFERS_QUEUE_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca656141833befd21f204c7d9f7687b9cf',1,'CAP_PROP_XI_BUFFERS_QUEUE_SIZE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f00_369',['CAP_PROP_XI_CC_MATRIX_00',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3f848989fa4782daed55e6d66db49f75',1,'cv::CAP_PROP_XI_CC_MATRIX_00'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3f848989fa4782daed55e6d66db49f75',1,'cv::CAP_PROP_XI_CC_MATRIX_00'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3f848989fa4782daed55e6d66db49f75',1,'CAP_PROP_XI_CC_MATRIX_00(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f01_370',['CAP_PROP_XI_CC_MATRIX_01',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca95e27d9c6825f62a75f6e5925a10a660',1,'cv::CAP_PROP_XI_CC_MATRIX_01'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca95e27d9c6825f62a75f6e5925a10a660',1,'cv::CAP_PROP_XI_CC_MATRIX_01'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca95e27d9c6825f62a75f6e5925a10a660',1,'CAP_PROP_XI_CC_MATRIX_01(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f02_371',['CAP_PROP_XI_CC_MATRIX_02',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac24b38753dc61ea5a34e8e24cb1b7ebb',1,'cv::CAP_PROP_XI_CC_MATRIX_02'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac24b38753dc61ea5a34e8e24cb1b7ebb',1,'cv::CAP_PROP_XI_CC_MATRIX_02'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac24b38753dc61ea5a34e8e24cb1b7ebb',1,'CAP_PROP_XI_CC_MATRIX_02(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f03_372',['CAP_PROP_XI_CC_MATRIX_03',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab4dc65aa8bf1e3264c130f2ca438ebbd',1,'cv::CAP_PROP_XI_CC_MATRIX_03'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab4dc65aa8bf1e3264c130f2ca438ebbd',1,'cv::CAP_PROP_XI_CC_MATRIX_03'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab4dc65aa8bf1e3264c130f2ca438ebbd',1,'CAP_PROP_XI_CC_MATRIX_03(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f10_373',['CAP_PROP_XI_CC_MATRIX_10',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa680ef94ac047467b30eb19d0ab9e3e1',1,'cv::CAP_PROP_XI_CC_MATRIX_10'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa680ef94ac047467b30eb19d0ab9e3e1',1,'cv::CAP_PROP_XI_CC_MATRIX_10'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa680ef94ac047467b30eb19d0ab9e3e1',1,'CAP_PROP_XI_CC_MATRIX_10(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f11_374',['CAP_PROP_XI_CC_MATRIX_11',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca88e6261d6402965b2188dffa5da40a3e',1,'cv::CAP_PROP_XI_CC_MATRIX_11'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca88e6261d6402965b2188dffa5da40a3e',1,'cv::CAP_PROP_XI_CC_MATRIX_11'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca88e6261d6402965b2188dffa5da40a3e',1,'CAP_PROP_XI_CC_MATRIX_11(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f12_375',['CAP_PROP_XI_CC_MATRIX_12',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaebd3e3ef66d136f30d7ae884775d92e5',1,'cv::CAP_PROP_XI_CC_MATRIX_12'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaebd3e3ef66d136f30d7ae884775d92e5',1,'cv::CAP_PROP_XI_CC_MATRIX_12'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaebd3e3ef66d136f30d7ae884775d92e5',1,'CAP_PROP_XI_CC_MATRIX_12(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f13_376',['CAP_PROP_XI_CC_MATRIX_13',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf90a703023bce0fa393089f8944167fb',1,'cv::CAP_PROP_XI_CC_MATRIX_13'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf90a703023bce0fa393089f8944167fb',1,'cv::CAP_PROP_XI_CC_MATRIX_13'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf90a703023bce0fa393089f8944167fb',1,'CAP_PROP_XI_CC_MATRIX_13(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f20_377',['CAP_PROP_XI_CC_MATRIX_20',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca03c5b9f730df89e85d3c1f9f062f8477',1,'cv::CAP_PROP_XI_CC_MATRIX_20'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca03c5b9f730df89e85d3c1f9f062f8477',1,'cv::CAP_PROP_XI_CC_MATRIX_20'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca03c5b9f730df89e85d3c1f9f062f8477',1,'CAP_PROP_XI_CC_MATRIX_20(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f21_378',['CAP_PROP_XI_CC_MATRIX_21',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1e9e100b5881d8bec3749279e9b0a18f',1,'cv::CAP_PROP_XI_CC_MATRIX_21'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1e9e100b5881d8bec3749279e9b0a18f',1,'cv::CAP_PROP_XI_CC_MATRIX_21'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1e9e100b5881d8bec3749279e9b0a18f',1,'CAP_PROP_XI_CC_MATRIX_21(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f22_379',['CAP_PROP_XI_CC_MATRIX_22',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad39c4868d1fd828a13301c4e3a484c1a',1,'cv::CAP_PROP_XI_CC_MATRIX_22'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad39c4868d1fd828a13301c4e3a484c1a',1,'cv::CAP_PROP_XI_CC_MATRIX_22'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad39c4868d1fd828a13301c4e3a484c1a',1,'CAP_PROP_XI_CC_MATRIX_22(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f23_380',['CAP_PROP_XI_CC_MATRIX_23',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad32906e25f6e4b3b7a721f019980a2df',1,'cv::CAP_PROP_XI_CC_MATRIX_23'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad32906e25f6e4b3b7a721f019980a2df',1,'cv::CAP_PROP_XI_CC_MATRIX_23'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad32906e25f6e4b3b7a721f019980a2df',1,'CAP_PROP_XI_CC_MATRIX_23(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f30_381',['CAP_PROP_XI_CC_MATRIX_30',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacb9360352011126b2c5b22f00d2bc825',1,'cv::CAP_PROP_XI_CC_MATRIX_30'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacb9360352011126b2c5b22f00d2bc825',1,'cv::CAP_PROP_XI_CC_MATRIX_30'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacb9360352011126b2c5b22f00d2bc825',1,'CAP_PROP_XI_CC_MATRIX_30(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f31_382',['CAP_PROP_XI_CC_MATRIX_31',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5f0675b49efc4bf8afa8c3e5a021f947',1,'cv::CAP_PROP_XI_CC_MATRIX_31'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5f0675b49efc4bf8afa8c3e5a021f947',1,'cv::CAP_PROP_XI_CC_MATRIX_31'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5f0675b49efc4bf8afa8c3e5a021f947',1,'CAP_PROP_XI_CC_MATRIX_31(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f32_383',['CAP_PROP_XI_CC_MATRIX_32',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac7a263f10e2aa915d0db21d000f677dd',1,'cv::CAP_PROP_XI_CC_MATRIX_32'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac7a263f10e2aa915d0db21d000f677dd',1,'cv::CAP_PROP_XI_CC_MATRIX_32'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac7a263f10e2aa915d0db21d000f677dd',1,'CAP_PROP_XI_CC_MATRIX_32(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcc_5fmatrix_5f33_384',['CAP_PROP_XI_CC_MATRIX_33',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca56a526385841cb1b73c311b9ab3cd6f8',1,'cv::CAP_PROP_XI_CC_MATRIX_33'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca56a526385841cb1b73c311b9ab3cd6f8',1,'cv::CAP_PROP_XI_CC_MATRIX_33'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca56a526385841cb1b73c311b9ab3cd6f8',1,'CAP_PROP_XI_CC_MATRIX_33(Global Namespace)']]], + ['cap_5fprop_5fxi_5fchip_5ftemp_385',['CAP_PROP_XI_CHIP_TEMP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaabb95af76be80f6b87680c4b257f98ee',1,'cv::CAP_PROP_XI_CHIP_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaabb95af76be80f6b87680c4b257f98ee',1,'cv::CAP_PROP_XI_CHIP_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaabb95af76be80f6b87680c4b257f98ee',1,'CAP_PROP_XI_CHIP_TEMP(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcms_386',['CAP_PROP_XI_CMS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4b9de3101c09c901dd98a0f9b64b807a',1,'cv::CAP_PROP_XI_CMS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4b9de3101c09c901dd98a0f9b64b807a',1,'cv::CAP_PROP_XI_CMS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4b9de3101c09c901dd98a0f9b64b807a',1,'CAP_PROP_XI_CMS(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcolor_5ffilter_5farray_387',['CAP_PROP_XI_COLOR_FILTER_ARRAY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca43d1598de031e32b1573edd86971f397',1,'cv::CAP_PROP_XI_COLOR_FILTER_ARRAY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca43d1598de031e32b1573edd86971f397',1,'cv::CAP_PROP_XI_COLOR_FILTER_ARRAY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca43d1598de031e32b1573edd86971f397',1,'CAP_PROP_XI_COLOR_FILTER_ARRAY(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcolumn_5ffpn_5fcorrection_388',['CAP_PROP_XI_COLUMN_FPN_CORRECTION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5799261a0420d625f4f9e3ef3ac141fd',1,'cv::CAP_PROP_XI_COLUMN_FPN_CORRECTION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5799261a0420d625f4f9e3ef3ac141fd',1,'cv::CAP_PROP_XI_COLUMN_FPN_CORRECTION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5799261a0420d625f4f9e3ef3ac141fd',1,'CAP_PROP_XI_COLUMN_FPN_CORRECTION(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcooling_389',['CAP_PROP_XI_COOLING',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa2272098bfa67902996bc6908acb1f1c',1,'cv::CAP_PROP_XI_COOLING'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa2272098bfa67902996bc6908acb1f1c',1,'cv::CAP_PROP_XI_COOLING'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa2272098bfa67902996bc6908acb1f1c',1,'CAP_PROP_XI_COOLING(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcounter_5fselector_390',['CAP_PROP_XI_COUNTER_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab26bfa6487516f5a1c1422fa914de7b0',1,'cv::CAP_PROP_XI_COUNTER_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab26bfa6487516f5a1c1422fa914de7b0',1,'cv::CAP_PROP_XI_COUNTER_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab26bfa6487516f5a1c1422fa914de7b0',1,'CAP_PROP_XI_COUNTER_SELECTOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5fcounter_5fvalue_391',['CAP_PROP_XI_COUNTER_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1936978811c685c26c945937b62f56e3',1,'cv::CAP_PROP_XI_COUNTER_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1936978811c685c26c945937b62f56e3',1,'cv::CAP_PROP_XI_COUNTER_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1936978811c685c26c945937b62f56e3',1,'CAP_PROP_XI_COUNTER_VALUE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdata_5fformat_392',['CAP_PROP_XI_DATA_FORMAT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca78102975f149dfb80b657f2d4a263f56',1,'cv::CAP_PROP_XI_DATA_FORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca78102975f149dfb80b657f2d4a263f56',1,'cv::CAP_PROP_XI_DATA_FORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca78102975f149dfb80b657f2d4a263f56',1,'CAP_PROP_XI_DATA_FORMAT(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdebounce_5fen_393',['CAP_PROP_XI_DEBOUNCE_EN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcafbca56ae9dc4ffa899f971ad3568d357',1,'cv::CAP_PROP_XI_DEBOUNCE_EN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcafbca56ae9dc4ffa899f971ad3568d357',1,'cv::CAP_PROP_XI_DEBOUNCE_EN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcafbca56ae9dc4ffa899f971ad3568d357',1,'CAP_PROP_XI_DEBOUNCE_EN(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdebounce_5fpol_394',['CAP_PROP_XI_DEBOUNCE_POL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab9a4ade923237e2ecd6d28ee091c8979',1,'cv::CAP_PROP_XI_DEBOUNCE_POL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab9a4ade923237e2ecd6d28ee091c8979',1,'cv::CAP_PROP_XI_DEBOUNCE_POL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab9a4ade923237e2ecd6d28ee091c8979',1,'CAP_PROP_XI_DEBOUNCE_POL(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdebounce_5ft0_395',['CAP_PROP_XI_DEBOUNCE_T0',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabc52f65fa1d3a00eaeae28faae42c202',1,'cv::CAP_PROP_XI_DEBOUNCE_T0'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabc52f65fa1d3a00eaeae28faae42c202',1,'cv::CAP_PROP_XI_DEBOUNCE_T0'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabc52f65fa1d3a00eaeae28faae42c202',1,'CAP_PROP_XI_DEBOUNCE_T0(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdebounce_5ft1_396',['CAP_PROP_XI_DEBOUNCE_T1',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad5c9b833300a7a1c219ba1989f2976c4',1,'cv::CAP_PROP_XI_DEBOUNCE_T1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad5c9b833300a7a1c219ba1989f2976c4',1,'cv::CAP_PROP_XI_DEBOUNCE_T1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad5c9b833300a7a1c219ba1989f2976c4',1,'CAP_PROP_XI_DEBOUNCE_T1(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdebug_5flevel_397',['CAP_PROP_XI_DEBUG_LEVEL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca627a30de4f523437febda2d48e29c504',1,'cv::CAP_PROP_XI_DEBUG_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca627a30de4f523437febda2d48e29c504',1,'cv::CAP_PROP_XI_DEBUG_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca627a30de4f523437febda2d48e29c504',1,'CAP_PROP_XI_DEBUG_LEVEL(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdecimation_5fhorizontal_398',['CAP_PROP_XI_DECIMATION_HORIZONTAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcadbba432c72379e77501b3c00f87e5c8c',1,'cv::CAP_PROP_XI_DECIMATION_HORIZONTAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcadbba432c72379e77501b3c00f87e5c8c',1,'cv::CAP_PROP_XI_DECIMATION_HORIZONTAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcadbba432c72379e77501b3c00f87e5c8c',1,'CAP_PROP_XI_DECIMATION_HORIZONTAL(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdecimation_5fpattern_399',['CAP_PROP_XI_DECIMATION_PATTERN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0165a1d34902d00b60da24503bb051f3',1,'cv::CAP_PROP_XI_DECIMATION_PATTERN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0165a1d34902d00b60da24503bb051f3',1,'cv::CAP_PROP_XI_DECIMATION_PATTERN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0165a1d34902d00b60da24503bb051f3',1,'CAP_PROP_XI_DECIMATION_PATTERN(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdecimation_5fselector_400',['CAP_PROP_XI_DECIMATION_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1b9ad18b3612d2e3608ae81f88d77288',1,'cv::CAP_PROP_XI_DECIMATION_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1b9ad18b3612d2e3608ae81f88d77288',1,'cv::CAP_PROP_XI_DECIMATION_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1b9ad18b3612d2e3608ae81f88d77288',1,'CAP_PROP_XI_DECIMATION_SELECTOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdecimation_5fvertical_401',['CAP_PROP_XI_DECIMATION_VERTICAL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca62d52331d0200f822501b9e0e747d0e0',1,'cv::CAP_PROP_XI_DECIMATION_VERTICAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca62d52331d0200f822501b9e0e747d0e0',1,'cv::CAP_PROP_XI_DECIMATION_VERTICAL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca62d52331d0200f822501b9e0e747d0e0',1,'CAP_PROP_XI_DECIMATION_VERTICAL(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdefault_5fcc_5fmatrix_402',['CAP_PROP_XI_DEFAULT_CC_MATRIX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca32a46b42b8292aa0e6fcf362ee53ed61',1,'cv::CAP_PROP_XI_DEFAULT_CC_MATRIX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca32a46b42b8292aa0e6fcf362ee53ed61',1,'cv::CAP_PROP_XI_DEFAULT_CC_MATRIX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca32a46b42b8292aa0e6fcf362ee53ed61',1,'CAP_PROP_XI_DEFAULT_CC_MATRIX(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdevice_5fmodel_5fid_403',['CAP_PROP_XI_DEVICE_MODEL_ID',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2bec5db0ec17f9c5154ad75303590805',1,'cv::CAP_PROP_XI_DEVICE_MODEL_ID'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2bec5db0ec17f9c5154ad75303590805',1,'cv::CAP_PROP_XI_DEVICE_MODEL_ID'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2bec5db0ec17f9c5154ad75303590805',1,'CAP_PROP_XI_DEVICE_MODEL_ID(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdevice_5freset_404',['CAP_PROP_XI_DEVICE_RESET',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca28bbc3b30b0d6e4ef038f00e867871ef',1,'cv::CAP_PROP_XI_DEVICE_RESET'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca28bbc3b30b0d6e4ef038f00e867871ef',1,'cv::CAP_PROP_XI_DEVICE_RESET'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca28bbc3b30b0d6e4ef038f00e867871ef',1,'CAP_PROP_XI_DEVICE_RESET(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdevice_5fsn_405',['CAP_PROP_XI_DEVICE_SN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacff771ea3b2e38c53377b6e2c148d650',1,'cv::CAP_PROP_XI_DEVICE_SN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacff771ea3b2e38c53377b6e2c148d650',1,'cv::CAP_PROP_XI_DEVICE_SN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacff771ea3b2e38c53377b6e2c148d650',1,'CAP_PROP_XI_DEVICE_SN(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdownsampling_406',['CAP_PROP_XI_DOWNSAMPLING',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0b6409999490a804d1a06df43105e5cb',1,'cv::CAP_PROP_XI_DOWNSAMPLING'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0b6409999490a804d1a06df43105e5cb',1,'cv::CAP_PROP_XI_DOWNSAMPLING'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0b6409999490a804d1a06df43105e5cb',1,'CAP_PROP_XI_DOWNSAMPLING(Global Namespace)']]], + ['cap_5fprop_5fxi_5fdownsampling_5ftype_407',['CAP_PROP_XI_DOWNSAMPLING_TYPE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca206b435824abcca17fc5c405ee3bca44',1,'cv::CAP_PROP_XI_DOWNSAMPLING_TYPE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca206b435824abcca17fc5c405ee3bca44',1,'cv::CAP_PROP_XI_DOWNSAMPLING_TYPE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca206b435824abcca17fc5c405ee3bca44',1,'CAP_PROP_XI_DOWNSAMPLING_TYPE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fexp_5fpriority_408',['CAP_PROP_XI_EXP_PRIORITY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2ef62c529916491a59a4b5cca77bc7af',1,'cv::CAP_PROP_XI_EXP_PRIORITY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2ef62c529916491a59a4b5cca77bc7af',1,'cv::CAP_PROP_XI_EXP_PRIORITY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2ef62c529916491a59a4b5cca77bc7af',1,'CAP_PROP_XI_EXP_PRIORITY(Global Namespace)']]], + ['cap_5fprop_5fxi_5fexposure_409',['CAP_PROP_XI_EXPOSURE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaaa2e2d066a822de98d26f26c5511c805',1,'cv::CAP_PROP_XI_EXPOSURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaaa2e2d066a822de98d26f26c5511c805',1,'cv::CAP_PROP_XI_EXPOSURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaaa2e2d066a822de98d26f26c5511c805',1,'CAP_PROP_XI_EXPOSURE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fexposure_5fburst_5fcount_410',['CAP_PROP_XI_EXPOSURE_BURST_COUNT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca13f4135742d70478e25494bb12dac06d',1,'cv::CAP_PROP_XI_EXPOSURE_BURST_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca13f4135742d70478e25494bb12dac06d',1,'cv::CAP_PROP_XI_EXPOSURE_BURST_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca13f4135742d70478e25494bb12dac06d',1,'CAP_PROP_XI_EXPOSURE_BURST_COUNT(Global Namespace)']]], + ['cap_5fprop_5fxi_5fffs_5faccess_5fkey_411',['CAP_PROP_XI_FFS_ACCESS_KEY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca37f5748b495927f2a92370dd3a296766',1,'cv::CAP_PROP_XI_FFS_ACCESS_KEY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca37f5748b495927f2a92370dd3a296766',1,'cv::CAP_PROP_XI_FFS_ACCESS_KEY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca37f5748b495927f2a92370dd3a296766',1,'CAP_PROP_XI_FFS_ACCESS_KEY(Global Namespace)']]], + ['cap_5fprop_5fxi_5fffs_5ffile_5fid_412',['CAP_PROP_XI_FFS_FILE_ID',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8e843bc6a96b5fb81b45a8f37f00e3e8',1,'cv::CAP_PROP_XI_FFS_FILE_ID'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8e843bc6a96b5fb81b45a8f37f00e3e8',1,'cv::CAP_PROP_XI_FFS_FILE_ID'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8e843bc6a96b5fb81b45a8f37f00e3e8',1,'CAP_PROP_XI_FFS_FILE_ID(Global Namespace)']]], + ['cap_5fprop_5fxi_5fffs_5ffile_5fsize_413',['CAP_PROP_XI_FFS_FILE_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab6d8f3f143d9b3ff663b2877123aaf17',1,'cv::CAP_PROP_XI_FFS_FILE_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab6d8f3f143d9b3ff663b2877123aaf17',1,'cv::CAP_PROP_XI_FFS_FILE_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab6d8f3f143d9b3ff663b2877123aaf17',1,'CAP_PROP_XI_FFS_FILE_SIZE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fframerate_414',['CAP_PROP_XI_FRAMERATE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaed8586ad3c43e4d5761cc4b6a6549374',1,'cv::CAP_PROP_XI_FRAMERATE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaed8586ad3c43e4d5761cc4b6a6549374',1,'cv::CAP_PROP_XI_FRAMERATE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaed8586ad3c43e4d5761cc4b6a6549374',1,'CAP_PROP_XI_FRAMERATE(Global Namespace)']]], + ['cap_5fprop_5fxi_5ffree_5fffs_5fsize_415',['CAP_PROP_XI_FREE_FFS_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaab4b15d9df02a485c1197bdd76a5e7d9',1,'cv::CAP_PROP_XI_FREE_FFS_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaab4b15d9df02a485c1197bdd76a5e7d9',1,'cv::CAP_PROP_XI_FREE_FFS_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaab4b15d9df02a485c1197bdd76a5e7d9',1,'CAP_PROP_XI_FREE_FFS_SIZE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fgain_416',['CAP_PROP_XI_GAIN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2ce2015d26b875f9a5bba2c34efa881f',1,'cv::CAP_PROP_XI_GAIN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2ce2015d26b875f9a5bba2c34efa881f',1,'cv::CAP_PROP_XI_GAIN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2ce2015d26b875f9a5bba2c34efa881f',1,'CAP_PROP_XI_GAIN(Global Namespace)']]], + ['cap_5fprop_5fxi_5fgain_5fselector_417',['CAP_PROP_XI_GAIN_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5c4afbb52928cd2a035b46f90f0b77e7',1,'cv::CAP_PROP_XI_GAIN_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5c4afbb52928cd2a035b46f90f0b77e7',1,'cv::CAP_PROP_XI_GAIN_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5c4afbb52928cd2a035b46f90f0b77e7',1,'CAP_PROP_XI_GAIN_SELECTOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5fgammac_418',['CAP_PROP_XI_GAMMAC',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac51336a614b4d065e6ec6e4c9dbc75d4',1,'cv::CAP_PROP_XI_GAMMAC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac51336a614b4d065e6ec6e4c9dbc75d4',1,'cv::CAP_PROP_XI_GAMMAC'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac51336a614b4d065e6ec6e4c9dbc75d4',1,'CAP_PROP_XI_GAMMAC(Global Namespace)']]], + ['cap_5fprop_5fxi_5fgammay_419',['CAP_PROP_XI_GAMMAY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcadec96ba88422b04bb4b8b4f672f5c77b',1,'cv::CAP_PROP_XI_GAMMAY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcadec96ba88422b04bb4b8b4f672f5c77b',1,'cv::CAP_PROP_XI_GAMMAY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcadec96ba88422b04bb4b8b4f672f5c77b',1,'CAP_PROP_XI_GAMMAY(Global Namespace)']]], + ['cap_5fprop_5fxi_5fgpi_5flevel_420',['CAP_PROP_XI_GPI_LEVEL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab44ede586d7a2370e24ae87d6aa8afad',1,'cv::CAP_PROP_XI_GPI_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab44ede586d7a2370e24ae87d6aa8afad',1,'cv::CAP_PROP_XI_GPI_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab44ede586d7a2370e24ae87d6aa8afad',1,'CAP_PROP_XI_GPI_LEVEL(Global Namespace)']]], + ['cap_5fprop_5fxi_5fgpi_5fmode_421',['CAP_PROP_XI_GPI_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4dbdf76832838e9ad4b89da280bdcbca',1,'cv::CAP_PROP_XI_GPI_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4dbdf76832838e9ad4b89da280bdcbca',1,'cv::CAP_PROP_XI_GPI_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4dbdf76832838e9ad4b89da280bdcbca',1,'CAP_PROP_XI_GPI_MODE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fgpi_5fselector_422',['CAP_PROP_XI_GPI_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaaaa4bcf89caf285194c200b990d94b94',1,'cv::CAP_PROP_XI_GPI_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaaaa4bcf89caf285194c200b990d94b94',1,'cv::CAP_PROP_XI_GPI_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaaaa4bcf89caf285194c200b990d94b94',1,'CAP_PROP_XI_GPI_SELECTOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5fgpo_5fmode_423',['CAP_PROP_XI_GPO_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4aadd5055b767a8ebe6be43b15b165ac',1,'cv::CAP_PROP_XI_GPO_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4aadd5055b767a8ebe6be43b15b165ac',1,'cv::CAP_PROP_XI_GPO_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4aadd5055b767a8ebe6be43b15b165ac',1,'CAP_PROP_XI_GPO_MODE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fgpo_5fselector_424',['CAP_PROP_XI_GPO_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1785d9ac27c4d678dc0afad376322a48',1,'cv::CAP_PROP_XI_GPO_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1785d9ac27c4d678dc0afad376322a48',1,'cv::CAP_PROP_XI_GPO_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca1785d9ac27c4d678dc0afad376322a48',1,'CAP_PROP_XI_GPO_SELECTOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5fhdr_425',['CAP_PROP_XI_HDR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa66a91a6b9c0446067f92f552424c175',1,'cv::CAP_PROP_XI_HDR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa66a91a6b9c0446067f92f552424c175',1,'cv::CAP_PROP_XI_HDR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa66a91a6b9c0446067f92f552424c175',1,'CAP_PROP_XI_HDR(Global Namespace)']]], + ['cap_5fprop_5fxi_5fhdr_5fkneepoint_5fcount_426',['CAP_PROP_XI_HDR_KNEEPOINT_COUNT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca25f4ff6e0a75c6a4c3eb42ca69a99008',1,'cv::CAP_PROP_XI_HDR_KNEEPOINT_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca25f4ff6e0a75c6a4c3eb42ca69a99008',1,'cv::CAP_PROP_XI_HDR_KNEEPOINT_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca25f4ff6e0a75c6a4c3eb42ca69a99008',1,'CAP_PROP_XI_HDR_KNEEPOINT_COUNT(Global Namespace)']]], + ['cap_5fprop_5fxi_5fhdr_5ft1_427',['CAP_PROP_XI_HDR_T1',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad41c3fe9bf0384b4487b728ae8d71c6c',1,'cv::CAP_PROP_XI_HDR_T1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad41c3fe9bf0384b4487b728ae8d71c6c',1,'cv::CAP_PROP_XI_HDR_T1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad41c3fe9bf0384b4487b728ae8d71c6c',1,'CAP_PROP_XI_HDR_T1(Global Namespace)']]], + ['cap_5fprop_5fxi_5fhdr_5ft2_428',['CAP_PROP_XI_HDR_T2',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9462841c6f21b93462869a701078412d',1,'cv::CAP_PROP_XI_HDR_T2'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9462841c6f21b93462869a701078412d',1,'cv::CAP_PROP_XI_HDR_T2'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9462841c6f21b93462869a701078412d',1,'CAP_PROP_XI_HDR_T2(Global Namespace)']]], + ['cap_5fprop_5fxi_5fheight_429',['CAP_PROP_XI_HEIGHT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6d7d5e4b2602f9bff56564d884e08fe4',1,'cv::CAP_PROP_XI_HEIGHT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6d7d5e4b2602f9bff56564d884e08fe4',1,'cv::CAP_PROP_XI_HEIGHT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6d7d5e4b2602f9bff56564d884e08fe4',1,'CAP_PROP_XI_HEIGHT(Global Namespace)']]], + ['cap_5fprop_5fxi_5fhous_5fback_5fside_5ftemp_430',['CAP_PROP_XI_HOUS_BACK_SIDE_TEMP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac35662482264494d5d4a2d3694604454',1,'cv::CAP_PROP_XI_HOUS_BACK_SIDE_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac35662482264494d5d4a2d3694604454',1,'cv::CAP_PROP_XI_HOUS_BACK_SIDE_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac35662482264494d5d4a2d3694604454',1,'CAP_PROP_XI_HOUS_BACK_SIDE_TEMP(Global Namespace)']]], + ['cap_5fprop_5fxi_5fhous_5ftemp_431',['CAP_PROP_XI_HOUS_TEMP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa0b998a928fb6bdaa4dd1def71b5e15b',1,'cv::CAP_PROP_XI_HOUS_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa0b998a928fb6bdaa4dd1def71b5e15b',1,'cv::CAP_PROP_XI_HOUS_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa0b998a928fb6bdaa4dd1def71b5e15b',1,'CAP_PROP_XI_HOUS_TEMP(Global Namespace)']]], + ['cap_5fprop_5fxi_5fhw_5frevision_432',['CAP_PROP_XI_HW_REVISION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8dc2ca4801e0957fdf3f149c66c9f9c8',1,'cv::CAP_PROP_XI_HW_REVISION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8dc2ca4801e0957fdf3f149c66c9f9c8',1,'cv::CAP_PROP_XI_HW_REVISION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8dc2ca4801e0957fdf3f149c66c9f9c8',1,'CAP_PROP_XI_HW_REVISION(Global Namespace)']]], + ['cap_5fprop_5fxi_5fimage_5fblack_5flevel_433',['CAP_PROP_XI_IMAGE_BLACK_LEVEL',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca97c3f4c0e44b9f06581578f7d03b9dbf',1,'cv::CAP_PROP_XI_IMAGE_BLACK_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca97c3f4c0e44b9f06581578f7d03b9dbf',1,'cv::CAP_PROP_XI_IMAGE_BLACK_LEVEL'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca97c3f4c0e44b9f06581578f7d03b9dbf',1,'CAP_PROP_XI_IMAGE_BLACK_LEVEL(Global Namespace)']]], + ['cap_5fprop_5fxi_5fimage_5fdata_5fbit_5fdepth_434',['CAP_PROP_XI_IMAGE_DATA_BIT_DEPTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3cb6414220dc96a4346dbb9820d6807c',1,'cv::CAP_PROP_XI_IMAGE_DATA_BIT_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3cb6414220dc96a4346dbb9820d6807c',1,'cv::CAP_PROP_XI_IMAGE_DATA_BIT_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3cb6414220dc96a4346dbb9820d6807c',1,'CAP_PROP_XI_IMAGE_DATA_BIT_DEPTH(Global Namespace)']]], + ['cap_5fprop_5fxi_5fimage_5fdata_5fformat_435',['CAP_PROP_XI_IMAGE_DATA_FORMAT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaace6b4af9afed47c6d39faa842607ab0',1,'cv::CAP_PROP_XI_IMAGE_DATA_FORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaace6b4af9afed47c6d39faa842607ab0',1,'cv::CAP_PROP_XI_IMAGE_DATA_FORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaace6b4af9afed47c6d39faa842607ab0',1,'CAP_PROP_XI_IMAGE_DATA_FORMAT(Global Namespace)']]], + ['cap_5fprop_5fxi_5fimage_5fdata_5fformat_5frgb32_5falpha_436',['CAP_PROP_XI_IMAGE_DATA_FORMAT_RGB32_ALPHA',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5cf923f4f06e03bd3edd5af3a44135e7',1,'cv::CAP_PROP_XI_IMAGE_DATA_FORMAT_RGB32_ALPHA'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5cf923f4f06e03bd3edd5af3a44135e7',1,'cv::CAP_PROP_XI_IMAGE_DATA_FORMAT_RGB32_ALPHA'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5cf923f4f06e03bd3edd5af3a44135e7',1,'CAP_PROP_XI_IMAGE_DATA_FORMAT_RGB32_ALPHA(Global Namespace)']]], + ['cap_5fprop_5fxi_5fimage_5fis_5fcolor_437',['CAP_PROP_XI_IMAGE_IS_COLOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3474bff058406213c00f940b7d39ca03',1,'cv::CAP_PROP_XI_IMAGE_IS_COLOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3474bff058406213c00f940b7d39ca03',1,'cv::CAP_PROP_XI_IMAGE_IS_COLOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3474bff058406213c00f940b7d39ca03',1,'CAP_PROP_XI_IMAGE_IS_COLOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5fimage_5fpayload_5fsize_438',['CAP_PROP_XI_IMAGE_PAYLOAD_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7e3cfe131842e34628f998dc87adf229',1,'cv::CAP_PROP_XI_IMAGE_PAYLOAD_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7e3cfe131842e34628f998dc87adf229',1,'cv::CAP_PROP_XI_IMAGE_PAYLOAD_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7e3cfe131842e34628f998dc87adf229',1,'CAP_PROP_XI_IMAGE_PAYLOAD_SIZE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fis_5fcooled_439',['CAP_PROP_XI_IS_COOLED',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad6a369e15415652c07377e617c31b816',1,'cv::CAP_PROP_XI_IS_COOLED'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad6a369e15415652c07377e617c31b816',1,'cv::CAP_PROP_XI_IS_COOLED'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad6a369e15415652c07377e617c31b816',1,'CAP_PROP_XI_IS_COOLED(Global Namespace)']]], + ['cap_5fprop_5fxi_5fis_5fdevice_5fexist_440',['CAP_PROP_XI_IS_DEVICE_EXIST',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5d8a3630e00a1edcb6562445ac7c97e5',1,'cv::CAP_PROP_XI_IS_DEVICE_EXIST'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5d8a3630e00a1edcb6562445ac7c97e5',1,'cv::CAP_PROP_XI_IS_DEVICE_EXIST'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5d8a3630e00a1edcb6562445ac7c97e5',1,'CAP_PROP_XI_IS_DEVICE_EXIST(Global Namespace)']]], + ['cap_5fprop_5fxi_5fkneepoint1_441',['CAP_PROP_XI_KNEEPOINT1',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacd116ed9889b08b5f617d35b74149669',1,'cv::CAP_PROP_XI_KNEEPOINT1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacd116ed9889b08b5f617d35b74149669',1,'cv::CAP_PROP_XI_KNEEPOINT1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcacd116ed9889b08b5f617d35b74149669',1,'CAP_PROP_XI_KNEEPOINT1(Global Namespace)']]], + ['cap_5fprop_5fxi_5fkneepoint2_442',['CAP_PROP_XI_KNEEPOINT2',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca975d8587ffcaac63ee6d7c733b378fcd',1,'cv::CAP_PROP_XI_KNEEPOINT2'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca975d8587ffcaac63ee6d7c733b378fcd',1,'cv::CAP_PROP_XI_KNEEPOINT2'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca975d8587ffcaac63ee6d7c733b378fcd',1,'CAP_PROP_XI_KNEEPOINT2(Global Namespace)']]], + ['cap_5fprop_5fxi_5fled_5fmode_443',['CAP_PROP_XI_LED_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca722e0061b85c4785608ac5ac7a473c00',1,'cv::CAP_PROP_XI_LED_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca722e0061b85c4785608ac5ac7a473c00',1,'cv::CAP_PROP_XI_LED_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca722e0061b85c4785608ac5ac7a473c00',1,'CAP_PROP_XI_LED_MODE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fled_5fselector_444',['CAP_PROP_XI_LED_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9dbacb0484a6cceef5afd4496740e3f7',1,'cv::CAP_PROP_XI_LED_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9dbacb0484a6cceef5afd4496740e3f7',1,'cv::CAP_PROP_XI_LED_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9dbacb0484a6cceef5afd4496740e3f7',1,'CAP_PROP_XI_LED_SELECTOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5flens_5faperture_5fvalue_445',['CAP_PROP_XI_LENS_APERTURE_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca307eab1a5189dfde4c57eda926f48383',1,'cv::CAP_PROP_XI_LENS_APERTURE_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca307eab1a5189dfde4c57eda926f48383',1,'cv::CAP_PROP_XI_LENS_APERTURE_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca307eab1a5189dfde4c57eda926f48383',1,'CAP_PROP_XI_LENS_APERTURE_VALUE(Global Namespace)']]], + ['cap_5fprop_5fxi_5flens_5ffeature_446',['CAP_PROP_XI_LENS_FEATURE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca42e9e7a34d9d173ba710e8dd69205657',1,'cv::CAP_PROP_XI_LENS_FEATURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca42e9e7a34d9d173ba710e8dd69205657',1,'cv::CAP_PROP_XI_LENS_FEATURE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca42e9e7a34d9d173ba710e8dd69205657',1,'CAP_PROP_XI_LENS_FEATURE(Global Namespace)']]], + ['cap_5fprop_5fxi_5flens_5ffeature_5fselector_447',['CAP_PROP_XI_LENS_FEATURE_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab28c47b9f81e7fa9d2ecccfaa3a287ea',1,'cv::CAP_PROP_XI_LENS_FEATURE_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab28c47b9f81e7fa9d2ecccfaa3a287ea',1,'cv::CAP_PROP_XI_LENS_FEATURE_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab28c47b9f81e7fa9d2ecccfaa3a287ea',1,'CAP_PROP_XI_LENS_FEATURE_SELECTOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5flens_5ffocal_5flength_448',['CAP_PROP_XI_LENS_FOCAL_LENGTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca903a9233d8a5231653a6217a8d360039',1,'cv::CAP_PROP_XI_LENS_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca903a9233d8a5231653a6217a8d360039',1,'cv::CAP_PROP_XI_LENS_FOCAL_LENGTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca903a9233d8a5231653a6217a8d360039',1,'CAP_PROP_XI_LENS_FOCAL_LENGTH(Global Namespace)']]], + ['cap_5fprop_5fxi_5flens_5ffocus_5fdistance_449',['CAP_PROP_XI_LENS_FOCUS_DISTANCE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7f9b49011d868c73fb578b540ddc0685',1,'cv::CAP_PROP_XI_LENS_FOCUS_DISTANCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7f9b49011d868c73fb578b540ddc0685',1,'cv::CAP_PROP_XI_LENS_FOCUS_DISTANCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7f9b49011d868c73fb578b540ddc0685',1,'CAP_PROP_XI_LENS_FOCUS_DISTANCE(Global Namespace)']]], + ['cap_5fprop_5fxi_5flens_5ffocus_5fmove_450',['CAP_PROP_XI_LENS_FOCUS_MOVE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad4cf2ae2680ee32f9acd3f080bb053ab',1,'cv::CAP_PROP_XI_LENS_FOCUS_MOVE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad4cf2ae2680ee32f9acd3f080bb053ab',1,'cv::CAP_PROP_XI_LENS_FOCUS_MOVE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcad4cf2ae2680ee32f9acd3f080bb053ab',1,'CAP_PROP_XI_LENS_FOCUS_MOVE(Global Namespace)']]], + ['cap_5fprop_5fxi_5flens_5ffocus_5fmovement_5fvalue_451',['CAP_PROP_XI_LENS_FOCUS_MOVEMENT_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaed9b0f1eaade0778e19a08726370b785',1,'cv::CAP_PROP_XI_LENS_FOCUS_MOVEMENT_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaed9b0f1eaade0778e19a08726370b785',1,'cv::CAP_PROP_XI_LENS_FOCUS_MOVEMENT_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaed9b0f1eaade0778e19a08726370b785',1,'CAP_PROP_XI_LENS_FOCUS_MOVEMENT_VALUE(Global Namespace)']]], + ['cap_5fprop_5fxi_5flens_5fmode_452',['CAP_PROP_XI_LENS_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2bcfc66b47eb20fe0be9922d6faf0fa3',1,'cv::CAP_PROP_XI_LENS_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2bcfc66b47eb20fe0be9922d6faf0fa3',1,'cv::CAP_PROP_XI_LENS_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca2bcfc66b47eb20fe0be9922d6faf0fa3',1,'CAP_PROP_XI_LENS_MODE(Global Namespace)']]], + ['cap_5fprop_5fxi_5flimit_5fbandwidth_453',['CAP_PROP_XI_LIMIT_BANDWIDTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3ba1662e0b303848e464d138a42a3f8d',1,'cv::CAP_PROP_XI_LIMIT_BANDWIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3ba1662e0b303848e464d138a42a3f8d',1,'cv::CAP_PROP_XI_LIMIT_BANDWIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca3ba1662e0b303848e464d138a42a3f8d',1,'CAP_PROP_XI_LIMIT_BANDWIDTH(Global Namespace)']]], + ['cap_5fprop_5fxi_5flut_5fen_454',['CAP_PROP_XI_LUT_EN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa47de0c7b39fd5adc6797edbb15a2174',1,'cv::CAP_PROP_XI_LUT_EN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa47de0c7b39fd5adc6797edbb15a2174',1,'cv::CAP_PROP_XI_LUT_EN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa47de0c7b39fd5adc6797edbb15a2174',1,'CAP_PROP_XI_LUT_EN(Global Namespace)']]], + ['cap_5fprop_5fxi_5flut_5findex_455',['CAP_PROP_XI_LUT_INDEX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca12fc0fdcee31edf2a9e1a3f7fdbefacd',1,'cv::CAP_PROP_XI_LUT_INDEX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca12fc0fdcee31edf2a9e1a3f7fdbefacd',1,'cv::CAP_PROP_XI_LUT_INDEX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca12fc0fdcee31edf2a9e1a3f7fdbefacd',1,'CAP_PROP_XI_LUT_INDEX(Global Namespace)']]], + ['cap_5fprop_5fxi_5flut_5fvalue_456',['CAP_PROP_XI_LUT_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca98d369394fa4657593238af9a30fcd80',1,'cv::CAP_PROP_XI_LUT_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca98d369394fa4657593238af9a30fcd80',1,'cv::CAP_PROP_XI_LUT_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca98d369394fa4657593238af9a30fcd80',1,'CAP_PROP_XI_LUT_VALUE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fmanual_5fwb_457',['CAP_PROP_XI_MANUAL_WB',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf8a5a64e094123892b5813fff1188706',1,'cv::CAP_PROP_XI_MANUAL_WB'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf8a5a64e094123892b5813fff1188706',1,'cv::CAP_PROP_XI_MANUAL_WB'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf8a5a64e094123892b5813fff1188706',1,'CAP_PROP_XI_MANUAL_WB(Global Namespace)']]], + ['cap_5fprop_5fxi_5foffset_5fx_458',['CAP_PROP_XI_OFFSET_X',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4b7b75badbf59d821962c06cf4d025bb',1,'cv::CAP_PROP_XI_OFFSET_X'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4b7b75badbf59d821962c06cf4d025bb',1,'cv::CAP_PROP_XI_OFFSET_X'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4b7b75badbf59d821962c06cf4d025bb',1,'CAP_PROP_XI_OFFSET_X(Global Namespace)']]], + ['cap_5fprop_5fxi_5foffset_5fy_459',['CAP_PROP_XI_OFFSET_Y',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6724b0905a0bda1166a67f6ccbc70327',1,'cv::CAP_PROP_XI_OFFSET_Y'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6724b0905a0bda1166a67f6ccbc70327',1,'cv::CAP_PROP_XI_OFFSET_Y'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6724b0905a0bda1166a67f6ccbc70327',1,'CAP_PROP_XI_OFFSET_Y(Global Namespace)']]], + ['cap_5fprop_5fxi_5foutput_5fdata_5fbit_5fdepth_460',['CAP_PROP_XI_OUTPUT_DATA_BIT_DEPTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0582602575f693d8cf9f9da68f8d7e4e',1,'cv::CAP_PROP_XI_OUTPUT_DATA_BIT_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0582602575f693d8cf9f9da68f8d7e4e',1,'cv::CAP_PROP_XI_OUTPUT_DATA_BIT_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0582602575f693d8cf9f9da68f8d7e4e',1,'CAP_PROP_XI_OUTPUT_DATA_BIT_DEPTH(Global Namespace)']]], + ['cap_5fprop_5fxi_5foutput_5fdata_5fpacking_461',['CAP_PROP_XI_OUTPUT_DATA_PACKING',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9de43705d72a70642b315c0164d3f706',1,'cv::CAP_PROP_XI_OUTPUT_DATA_PACKING'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9de43705d72a70642b315c0164d3f706',1,'cv::CAP_PROP_XI_OUTPUT_DATA_PACKING'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca9de43705d72a70642b315c0164d3f706',1,'CAP_PROP_XI_OUTPUT_DATA_PACKING(Global Namespace)']]], + ['cap_5fprop_5fxi_5foutput_5fdata_5fpacking_5ftype_462',['CAP_PROP_XI_OUTPUT_DATA_PACKING_TYPE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4dd38252df8993caaa6a94991c7c710a',1,'cv::CAP_PROP_XI_OUTPUT_DATA_PACKING_TYPE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4dd38252df8993caaa6a94991c7c710a',1,'cv::CAP_PROP_XI_OUTPUT_DATA_PACKING_TYPE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca4dd38252df8993caaa6a94991c7c710a',1,'CAP_PROP_XI_OUTPUT_DATA_PACKING_TYPE(Global Namespace)']]], + ['cap_5fprop_5fxi_5frecent_5fframe_463',['CAP_PROP_XI_RECENT_FRAME',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab6ae274d73be763065ae6d4157c33e30',1,'cv::CAP_PROP_XI_RECENT_FRAME'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab6ae274d73be763065ae6d4157c33e30',1,'cv::CAP_PROP_XI_RECENT_FRAME'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab6ae274d73be763065ae6d4157c33e30',1,'CAP_PROP_XI_RECENT_FRAME(Global Namespace)']]], + ['cap_5fprop_5fxi_5fregion_5fmode_464',['CAP_PROP_XI_REGION_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcae147b9f0ff2b052840cfbde354db8370',1,'cv::CAP_PROP_XI_REGION_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcae147b9f0ff2b052840cfbde354db8370',1,'cv::CAP_PROP_XI_REGION_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcae147b9f0ff2b052840cfbde354db8370',1,'CAP_PROP_XI_REGION_MODE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fregion_5fselector_465',['CAP_PROP_XI_REGION_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcafa595df0cdf5b73134aa29a67ccabc74',1,'cv::CAP_PROP_XI_REGION_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcafa595df0cdf5b73134aa29a67ccabc74',1,'cv::CAP_PROP_XI_REGION_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcafa595df0cdf5b73134aa29a67ccabc74',1,'CAP_PROP_XI_REGION_SELECTOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5frow_5ffpn_5fcorrection_466',['CAP_PROP_XI_ROW_FPN_CORRECTION',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca162e9f64020df1cd6d9cba4b3198061f',1,'cv::CAP_PROP_XI_ROW_FPN_CORRECTION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca162e9f64020df1cd6d9cba4b3198061f',1,'cv::CAP_PROP_XI_ROW_FPN_CORRECTION'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca162e9f64020df1cd6d9cba4b3198061f',1,'CAP_PROP_XI_ROW_FPN_CORRECTION(Global Namespace)']]], + ['cap_5fprop_5fxi_5fsensor_5fboard_5ftemp_467',['CAP_PROP_XI_SENSOR_BOARD_TEMP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca94305071b134947bedeeb4c5dd59418e',1,'cv::CAP_PROP_XI_SENSOR_BOARD_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca94305071b134947bedeeb4c5dd59418e',1,'cv::CAP_PROP_XI_SENSOR_BOARD_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca94305071b134947bedeeb4c5dd59418e',1,'CAP_PROP_XI_SENSOR_BOARD_TEMP(Global Namespace)']]], + ['cap_5fprop_5fxi_5fsensor_5fclock_5ffreq_5fhz_468',['CAP_PROP_XI_SENSOR_CLOCK_FREQ_HZ',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa79cb01e1a0fba12586631d22896805d',1,'cv::CAP_PROP_XI_SENSOR_CLOCK_FREQ_HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa79cb01e1a0fba12586631d22896805d',1,'cv::CAP_PROP_XI_SENSOR_CLOCK_FREQ_HZ'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa79cb01e1a0fba12586631d22896805d',1,'CAP_PROP_XI_SENSOR_CLOCK_FREQ_HZ(Global Namespace)']]], + ['cap_5fprop_5fxi_5fsensor_5fclock_5ffreq_5findex_469',['CAP_PROP_XI_SENSOR_CLOCK_FREQ_INDEX',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca762ae4ae81179e7d1806ca2c09ede2a4',1,'cv::CAP_PROP_XI_SENSOR_CLOCK_FREQ_INDEX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca762ae4ae81179e7d1806ca2c09ede2a4',1,'cv::CAP_PROP_XI_SENSOR_CLOCK_FREQ_INDEX'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca762ae4ae81179e7d1806ca2c09ede2a4',1,'CAP_PROP_XI_SENSOR_CLOCK_FREQ_INDEX(Global Namespace)']]], + ['cap_5fprop_5fxi_5fsensor_5fdata_5fbit_5fdepth_470',['CAP_PROP_XI_SENSOR_DATA_BIT_DEPTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca21c86de9892de694193d5d778433ce1f',1,'cv::CAP_PROP_XI_SENSOR_DATA_BIT_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca21c86de9892de694193d5d778433ce1f',1,'cv::CAP_PROP_XI_SENSOR_DATA_BIT_DEPTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca21c86de9892de694193d5d778433ce1f',1,'CAP_PROP_XI_SENSOR_DATA_BIT_DEPTH(Global Namespace)']]], + ['cap_5fprop_5fxi_5fsensor_5ffeature_5fselector_471',['CAP_PROP_XI_SENSOR_FEATURE_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa27042108d67ac05c59c09f0e8191980',1,'cv::CAP_PROP_XI_SENSOR_FEATURE_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa27042108d67ac05c59c09f0e8191980',1,'cv::CAP_PROP_XI_SENSOR_FEATURE_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa27042108d67ac05c59c09f0e8191980',1,'CAP_PROP_XI_SENSOR_FEATURE_SELECTOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5fsensor_5ffeature_5fvalue_472',['CAP_PROP_XI_SENSOR_FEATURE_VALUE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca582364263b7b374acfda85afc3b8984d',1,'cv::CAP_PROP_XI_SENSOR_FEATURE_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca582364263b7b374acfda85afc3b8984d',1,'cv::CAP_PROP_XI_SENSOR_FEATURE_VALUE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca582364263b7b374acfda85afc3b8984d',1,'CAP_PROP_XI_SENSOR_FEATURE_VALUE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fsensor_5fmode_473',['CAP_PROP_XI_SENSOR_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca74407dd885ecbf8a74358e3f01c8687e',1,'cv::CAP_PROP_XI_SENSOR_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca74407dd885ecbf8a74358e3f01c8687e',1,'cv::CAP_PROP_XI_SENSOR_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca74407dd885ecbf8a74358e3f01c8687e',1,'CAP_PROP_XI_SENSOR_MODE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fsensor_5foutput_5fchannel_5fcount_474',['CAP_PROP_XI_SENSOR_OUTPUT_CHANNEL_COUNT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca013c1c3db5462bd5e762a5c2c94a4da0',1,'cv::CAP_PROP_XI_SENSOR_OUTPUT_CHANNEL_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca013c1c3db5462bd5e762a5c2c94a4da0',1,'cv::CAP_PROP_XI_SENSOR_OUTPUT_CHANNEL_COUNT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca013c1c3db5462bd5e762a5c2c94a4da0',1,'CAP_PROP_XI_SENSOR_OUTPUT_CHANNEL_COUNT(Global Namespace)']]], + ['cap_5fprop_5fxi_5fsensor_5ftaps_475',['CAP_PROP_XI_SENSOR_TAPS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca94443f6400743b92ab0d747cccd94733',1,'cv::CAP_PROP_XI_SENSOR_TAPS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca94443f6400743b92ab0d747cccd94733',1,'cv::CAP_PROP_XI_SENSOR_TAPS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca94443f6400743b92ab0d747cccd94733',1,'CAP_PROP_XI_SENSOR_TAPS(Global Namespace)']]], + ['cap_5fprop_5fxi_5fsharpness_476',['CAP_PROP_XI_SHARPNESS',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0cb34cbfab7826a77b11c241d1b68058',1,'cv::CAP_PROP_XI_SHARPNESS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0cb34cbfab7826a77b11c241d1b68058',1,'cv::CAP_PROP_XI_SHARPNESS'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca0cb34cbfab7826a77b11c241d1b68058',1,'CAP_PROP_XI_SHARPNESS(Global Namespace)']]], + ['cap_5fprop_5fxi_5fshutter_5ftype_477',['CAP_PROP_XI_SHUTTER_TYPE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabe84384ce558a68b1fb119c26a1fb1c7',1,'cv::CAP_PROP_XI_SHUTTER_TYPE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabe84384ce558a68b1fb119c26a1fb1c7',1,'cv::CAP_PROP_XI_SHUTTER_TYPE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcabe84384ce558a68b1fb119c26a1fb1c7',1,'CAP_PROP_XI_SHUTTER_TYPE(Global Namespace)']]], + ['cap_5fprop_5fxi_5ftarget_5ftemp_478',['CAP_PROP_XI_TARGET_TEMP',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7a5b70e760f454ba83133e868e8bff98',1,'cv::CAP_PROP_XI_TARGET_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7a5b70e760f454ba83133e868e8bff98',1,'cv::CAP_PROP_XI_TARGET_TEMP'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca7a5b70e760f454ba83133e868e8bff98',1,'CAP_PROP_XI_TARGET_TEMP(Global Namespace)']]], + ['cap_5fprop_5fxi_5ftest_5fpattern_479',['CAP_PROP_XI_TEST_PATTERN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf6e3addcd1dc86db902982df976ef398',1,'cv::CAP_PROP_XI_TEST_PATTERN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf6e3addcd1dc86db902982df976ef398',1,'cv::CAP_PROP_XI_TEST_PATTERN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf6e3addcd1dc86db902982df976ef398',1,'CAP_PROP_XI_TEST_PATTERN(Global Namespace)']]], + ['cap_5fprop_5fxi_5ftest_5fpattern_5fgenerator_5fselector_480',['CAP_PROP_XI_TEST_PATTERN_GENERATOR_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac63611cdaf894d351b953c34b93bbe27',1,'cv::CAP_PROP_XI_TEST_PATTERN_GENERATOR_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac63611cdaf894d351b953c34b93bbe27',1,'cv::CAP_PROP_XI_TEST_PATTERN_GENERATOR_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac63611cdaf894d351b953c34b93bbe27',1,'CAP_PROP_XI_TEST_PATTERN_GENERATOR_SELECTOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5ftimeout_481',['CAP_PROP_XI_TIMEOUT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6c71b080417a0fe6b182f868c4a319a7',1,'cv::CAP_PROP_XI_TIMEOUT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6c71b080417a0fe6b182f868c4a319a7',1,'cv::CAP_PROP_XI_TIMEOUT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca6c71b080417a0fe6b182f868c4a319a7',1,'CAP_PROP_XI_TIMEOUT(Global Namespace)']]], + ['cap_5fprop_5fxi_5ftransport_5fpixel_5fformat_482',['CAP_PROP_XI_TRANSPORT_PIXEL_FORMAT',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab45acea64fe23cb73657b4b42d443a1b',1,'cv::CAP_PROP_XI_TRANSPORT_PIXEL_FORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab45acea64fe23cb73657b4b42d443a1b',1,'cv::CAP_PROP_XI_TRANSPORT_PIXEL_FORMAT'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcab45acea64fe23cb73657b4b42d443a1b',1,'CAP_PROP_XI_TRANSPORT_PIXEL_FORMAT(Global Namespace)']]], + ['cap_5fprop_5fxi_5ftrg_5fdelay_483',['CAP_PROP_XI_TRG_DELAY',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5ed0495b88a2983f8be36e17c63c51fc',1,'cv::CAP_PROP_XI_TRG_DELAY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5ed0495b88a2983f8be36e17c63c51fc',1,'cv::CAP_PROP_XI_TRG_DELAY'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5ed0495b88a2983f8be36e17c63c51fc',1,'CAP_PROP_XI_TRG_DELAY(Global Namespace)']]], + ['cap_5fprop_5fxi_5ftrg_5fselector_484',['CAP_PROP_XI_TRG_SELECTOR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca28611dcbbd5efd0c9fcfc03180ff13e6',1,'cv::CAP_PROP_XI_TRG_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca28611dcbbd5efd0c9fcfc03180ff13e6',1,'cv::CAP_PROP_XI_TRG_SELECTOR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca28611dcbbd5efd0c9fcfc03180ff13e6',1,'CAP_PROP_XI_TRG_SELECTOR(Global Namespace)']]], + ['cap_5fprop_5fxi_5ftrg_5fsoftware_485',['CAP_PROP_XI_TRG_SOFTWARE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa008a158bb86a33056b5cf20300b70fc',1,'cv::CAP_PROP_XI_TRG_SOFTWARE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa008a158bb86a33056b5cf20300b70fc',1,'cv::CAP_PROP_XI_TRG_SOFTWARE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa008a158bb86a33056b5cf20300b70fc',1,'CAP_PROP_XI_TRG_SOFTWARE(Global Namespace)']]], + ['cap_5fprop_5fxi_5ftrg_5fsource_486',['CAP_PROP_XI_TRG_SOURCE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa523371bc36e5e200dc8948a97a34bc9',1,'cv::CAP_PROP_XI_TRG_SOURCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa523371bc36e5e200dc8948a97a34bc9',1,'cv::CAP_PROP_XI_TRG_SOURCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaa523371bc36e5e200dc8948a97a34bc9',1,'CAP_PROP_XI_TRG_SOURCE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fts_5frst_5fmode_487',['CAP_PROP_XI_TS_RST_MODE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf1e0231c56b7d5ccb9b7d0dece3cd2f2',1,'cv::CAP_PROP_XI_TS_RST_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf1e0231c56b7d5ccb9b7d0dece3cd2f2',1,'cv::CAP_PROP_XI_TS_RST_MODE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcaf1e0231c56b7d5ccb9b7d0dece3cd2f2',1,'CAP_PROP_XI_TS_RST_MODE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fts_5frst_5fsource_488',['CAP_PROP_XI_TS_RST_SOURCE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca95df1de33780fe933834b6286c5b6696',1,'cv::CAP_PROP_XI_TS_RST_SOURCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca95df1de33780fe933834b6286c5b6696',1,'cv::CAP_PROP_XI_TS_RST_SOURCE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca95df1de33780fe933834b6286c5b6696',1,'CAP_PROP_XI_TS_RST_SOURCE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fused_5fffs_5fsize_489',['CAP_PROP_XI_USED_FFS_SIZE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac06438499f168922ffb7ff0a6d4565de',1,'cv::CAP_PROP_XI_USED_FFS_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac06438499f168922ffb7ff0a6d4565de',1,'cv::CAP_PROP_XI_USED_FFS_SIZE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bcac06438499f168922ffb7ff0a6d4565de',1,'CAP_PROP_XI_USED_FFS_SIZE(Global Namespace)']]], + ['cap_5fprop_5fxi_5fwb_5fkb_490',['CAP_PROP_XI_WB_KB',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca85591ebfaf9e08ac3298ffbddb4a6eb0',1,'cv::CAP_PROP_XI_WB_KB'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca85591ebfaf9e08ac3298ffbddb4a6eb0',1,'cv::CAP_PROP_XI_WB_KB'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca85591ebfaf9e08ac3298ffbddb4a6eb0',1,'CAP_PROP_XI_WB_KB(Global Namespace)']]], + ['cap_5fprop_5fxi_5fwb_5fkg_491',['CAP_PROP_XI_WB_KG',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca01849a14d6761cea0075d713ed1b13c3',1,'cv::CAP_PROP_XI_WB_KG'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca01849a14d6761cea0075d713ed1b13c3',1,'cv::CAP_PROP_XI_WB_KG'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca01849a14d6761cea0075d713ed1b13c3',1,'CAP_PROP_XI_WB_KG(Global Namespace)']]], + ['cap_5fprop_5fxi_5fwb_5fkr_492',['CAP_PROP_XI_WB_KR',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8501e38cd113a72c31555a8fb378b8c8',1,'cv::CAP_PROP_XI_WB_KR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8501e38cd113a72c31555a8fb378b8c8',1,'cv::CAP_PROP_XI_WB_KR'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca8501e38cd113a72c31555a8fb378b8c8',1,'CAP_PROP_XI_WB_KR(Global Namespace)']]], + ['cap_5fprop_5fxi_5fwidth_493',['CAP_PROP_XI_WIDTH',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5f993678826ae1397c77d05853e9ac47',1,'cv::CAP_PROP_XI_WIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5f993678826ae1397c77d05853e9ac47',1,'cv::CAP_PROP_XI_WIDTH'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga89a5ea2c97ef26165c47e792380b96bca5f993678826ae1397c77d05853e9ac47',1,'CAP_PROP_XI_WIDTH(Global Namespace)']]], + ['cap_5fprop_5fzoom_494',['CAP_PROP_ZOOM',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da73f3ec06cf4f9aca1ab7f3b52260fd5e',1,'cv::CAP_PROP_ZOOM'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#ggaeb8dd9c89c10a5c63c139bf7c4f5704da73f3ec06cf4f9aca1ab7f3b52260fd5e',1,'CAP_PROP_ZOOM(Global Namespace)']]], + ['cap_5fpvapi_495',['CAP_PVAPI',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daea3f59a31f396298b5b3531c23391e49',1,'cv::CAP_PVAPI'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294daea3f59a31f396298b5b3531c23391e49',1,'CAP_PVAPI(Global Namespace)']]], + ['cap_5fpvapi_5fdecimation_5f2outof16_496',['CAP_PVAPI_DECIMATION_2OUTOF16',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a93abac526319d5b0d39d89bce5508095',1,'cv::CAP_PVAPI_DECIMATION_2OUTOF16'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a93abac526319d5b0d39d89bce5508095',1,'cv::CAP_PVAPI_DECIMATION_2OUTOF16'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a93abac526319d5b0d39d89bce5508095',1,'CAP_PVAPI_DECIMATION_2OUTOF16(Global Namespace)']]], + ['cap_5fpvapi_5fdecimation_5f2outof4_497',['CAP_PVAPI_DECIMATION_2OUTOF4',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a65c059a6dfc8b709bc9bb33eb057e865',1,'cv::CAP_PVAPI_DECIMATION_2OUTOF4'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a65c059a6dfc8b709bc9bb33eb057e865',1,'cv::CAP_PVAPI_DECIMATION_2OUTOF4'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a65c059a6dfc8b709bc9bb33eb057e865',1,'CAP_PVAPI_DECIMATION_2OUTOF4(Global Namespace)']]], + ['cap_5fpvapi_5fdecimation_5f2outof8_498',['CAP_PVAPI_DECIMATION_2OUTOF8',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7aac6400fa67e4237c2bbe26fefa0c552d',1,'cv::CAP_PVAPI_DECIMATION_2OUTOF8'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7aac6400fa67e4237c2bbe26fefa0c552d',1,'cv::CAP_PVAPI_DECIMATION_2OUTOF8'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7aac6400fa67e4237c2bbe26fefa0c552d',1,'CAP_PVAPI_DECIMATION_2OUTOF8(Global Namespace)']]], + ['cap_5fpvapi_5fdecimation_5foff_499',['CAP_PVAPI_DECIMATION_OFF',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a77557674b55270997bb64557becdcae4',1,'cv::CAP_PVAPI_DECIMATION_OFF'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a77557674b55270997bb64557becdcae4',1,'cv::CAP_PVAPI_DECIMATION_OFF'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#gga6a131e13ead82b2256ec1184668ebde7a77557674b55270997bb64557becdcae4',1,'CAP_PVAPI_DECIMATION_OFF(Global Namespace)']]], + ['cap_5fpvapi_5ffstrigmode_5ffixedrate_500',['CAP_PVAPI_FSTRIGMODE_FIXEDRATE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150a393224986d05449896f3f1614865ac37',1,'cv::CAP_PVAPI_FSTRIGMODE_FIXEDRATE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150a393224986d05449896f3f1614865ac37',1,'cv::CAP_PVAPI_FSTRIGMODE_FIXEDRATE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150a393224986d05449896f3f1614865ac37',1,'CAP_PVAPI_FSTRIGMODE_FIXEDRATE(Global Namespace)']]], + ['cap_5fpvapi_5ffstrigmode_5ffreerun_501',['CAP_PVAPI_FSTRIGMODE_FREERUN',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150ad149577e9f1a26d0b9ab7cc38ea66e25',1,'cv::CAP_PVAPI_FSTRIGMODE_FREERUN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150ad149577e9f1a26d0b9ab7cc38ea66e25',1,'cv::CAP_PVAPI_FSTRIGMODE_FREERUN'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150ad149577e9f1a26d0b9ab7cc38ea66e25',1,'CAP_PVAPI_FSTRIGMODE_FREERUN(Global Namespace)']]], + ['cap_5fpvapi_5ffstrigmode_5fsoftware_502',['CAP_PVAPI_FSTRIGMODE_SOFTWARE',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150aadfb77546571860e37e5adf9ea661a72',1,'cv::CAP_PVAPI_FSTRIGMODE_SOFTWARE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150aadfb77546571860e37e5adf9ea661a72',1,'cv::CAP_PVAPI_FSTRIGMODE_SOFTWARE'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150aadfb77546571860e37e5adf9ea661a72',1,'CAP_PVAPI_FSTRIGMODE_SOFTWARE(Global Namespace)']]], + ['cap_5fpvapi_5ffstrigmode_5fsyncin1_503',['CAP_PVAPI_FSTRIGMODE_SYNCIN1',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150af199d5c684aa54a3d37a8a5d7ddfc3c3',1,'cv::CAP_PVAPI_FSTRIGMODE_SYNCIN1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150af199d5c684aa54a3d37a8a5d7ddfc3c3',1,'cv::CAP_PVAPI_FSTRIGMODE_SYNCIN1'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150af199d5c684aa54a3d37a8a5d7ddfc3c3',1,'CAP_PVAPI_FSTRIGMODE_SYNCIN1(Global Namespace)']]], + ['cap_5fpvapi_5ffstrigmode_5fsyncin2_504',['CAP_PVAPI_FSTRIGMODE_SYNCIN2',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150aca95ce56d9dea6f7addc0f578f0e960b',1,'cv::CAP_PVAPI_FSTRIGMODE_SYNCIN2'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150aca95ce56d9dea6f7addc0f578f0e960b',1,'cv::CAP_PVAPI_FSTRIGMODE_SYNCIN2'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggaf63d4c617c61e03ab502b3c836966150aca95ce56d9dea6f7addc0f578f0e960b',1,'CAP_PVAPI_FSTRIGMODE_SYNCIN2(Global Namespace)']]], + ['cap_5fpvapi_5fpixelformat_5fbayer16_505',['CAP_PVAPI_PIXELFORMAT_BAYER16',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a13e3854cacaa94dd376d6742b4701051',1,'cv::CAP_PVAPI_PIXELFORMAT_BAYER16'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a13e3854cacaa94dd376d6742b4701051',1,'cv::CAP_PVAPI_PIXELFORMAT_BAYER16'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a13e3854cacaa94dd376d6742b4701051',1,'CAP_PVAPI_PIXELFORMAT_BAYER16(Global Namespace)']]], + ['cap_5fpvapi_5fpixelformat_5fbayer8_506',['CAP_PVAPI_PIXELFORMAT_BAYER8',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a14cc8991f566cbb95661a95b9d02ff5f',1,'cv::CAP_PVAPI_PIXELFORMAT_BAYER8'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a14cc8991f566cbb95661a95b9d02ff5f',1,'cv::CAP_PVAPI_PIXELFORMAT_BAYER8'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a14cc8991f566cbb95661a95b9d02ff5f',1,'CAP_PVAPI_PIXELFORMAT_BAYER8(Global Namespace)']]], + ['cap_5fpvapi_5fpixelformat_5fbgr24_507',['CAP_PVAPI_PIXELFORMAT_BGR24',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6abcecb9c33a2533abfc3b2caf6ddf10e8',1,'cv::CAP_PVAPI_PIXELFORMAT_BGR24'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6abcecb9c33a2533abfc3b2caf6ddf10e8',1,'cv::CAP_PVAPI_PIXELFORMAT_BGR24'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6abcecb9c33a2533abfc3b2caf6ddf10e8',1,'CAP_PVAPI_PIXELFORMAT_BGR24(Global Namespace)']]], + ['cap_5fpvapi_5fpixelformat_5fbgra32_508',['CAP_PVAPI_PIXELFORMAT_BGRA32',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a0fa9e749378a7e1afdce0ef93bc98139',1,'cv::CAP_PVAPI_PIXELFORMAT_BGRA32'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a0fa9e749378a7e1afdce0ef93bc98139',1,'cv::CAP_PVAPI_PIXELFORMAT_BGRA32'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a0fa9e749378a7e1afdce0ef93bc98139',1,'CAP_PVAPI_PIXELFORMAT_BGRA32(Global Namespace)']]], + ['cap_5fpvapi_5fpixelformat_5fmono16_509',['CAP_PVAPI_PIXELFORMAT_MONO16',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6aac9c9b4bfc19ee84bd9428f0cca98c9a',1,'cv::CAP_PVAPI_PIXELFORMAT_MONO16'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6aac9c9b4bfc19ee84bd9428f0cca98c9a',1,'cv::CAP_PVAPI_PIXELFORMAT_MONO16'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6aac9c9b4bfc19ee84bd9428f0cca98c9a',1,'CAP_PVAPI_PIXELFORMAT_MONO16(Global Namespace)']]], + ['cap_5fpvapi_5fpixelformat_5fmono8_510',['CAP_PVAPI_PIXELFORMAT_MONO8',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a7910aa88e73d326883f0742f760ecae1',1,'cv::CAP_PVAPI_PIXELFORMAT_MONO8'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a7910aa88e73d326883f0742f760ecae1',1,'cv::CAP_PVAPI_PIXELFORMAT_MONO8'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a7910aa88e73d326883f0742f760ecae1',1,'CAP_PVAPI_PIXELFORMAT_MONO8(Global Namespace)']]], + ['cap_5fpvapi_5fpixelformat_5frgb24_511',['CAP_PVAPI_PIXELFORMAT_RGB24',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6acd6f4bfde8ab0461d43616e3f2c11b31',1,'cv::CAP_PVAPI_PIXELFORMAT_RGB24'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6acd6f4bfde8ab0461d43616e3f2c11b31',1,'cv::CAP_PVAPI_PIXELFORMAT_RGB24'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6acd6f4bfde8ab0461d43616e3f2c11b31',1,'CAP_PVAPI_PIXELFORMAT_RGB24(Global Namespace)']]], + ['cap_5fpvapi_5fpixelformat_5frgba32_512',['CAP_PVAPI_PIXELFORMAT_RGBA32',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a2069a8d1441e7c7c461273cf09692803',1,'cv::CAP_PVAPI_PIXELFORMAT_RGBA32'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a2069a8d1441e7c7c461273cf09692803',1,'cv::CAP_PVAPI_PIXELFORMAT_RGBA32'],['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html#ggac4d4a0a2caf6407eb5dfa6d5620137c6a2069a8d1441e7c7c461273cf09692803',1,'CAP_PVAPI_PIXELFORMAT_RGBA32(Global Namespace)']]], + ['cap_5fqt_513',['CAP_QT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dac06269ed54875916d93209669512c1c4',1,'cv::CAP_QT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294dac06269ed54875916d93209669512c1c4',1,'CAP_QT(Global Namespace)']]], + ['cap_5frealsense_514',['CAP_REALSENSE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da7f442efc12cf9056cf4dc1597ba7fda6',1,'cv::CAP_REALSENSE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da7f442efc12cf9056cf4dc1597ba7fda6',1,'CAP_REALSENSE(Global Namespace)']]], + ['cap_5funicap_515',['CAP_UNICAP',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da44311f187ece704740c79eedcadd9856',1,'cv::CAP_UNICAP'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da44311f187ece704740c79eedcadd9856',1,'CAP_UNICAP(Global Namespace)']]], + ['cap_5fv4l_516',['CAP_V4L',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da0c5f2eb9d2d43fb3582583203160a419',1,'cv::CAP_V4L'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da0c5f2eb9d2d43fb3582583203160a419',1,'CAP_V4L(Global Namespace)']]], + ['cap_5fv4l2_517',['CAP_V4L2',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da78d2234242b9be9c53196be7c2bb2537',1,'cv::CAP_V4L2'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da78d2234242b9be9c53196be7c2bb2537',1,'CAP_V4L2(Global Namespace)']]], + ['cap_5fvfw_518',['CAP_VFW',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da5290a0c5005edf1c5715a0c8e637b861',1,'cv::CAP_VFW'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da5290a0c5005edf1c5715a0c8e637b861',1,'CAP_VFW(Global Namespace)']]], + ['cap_5fwinrt_519',['CAP_WINRT',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da92175615b64b63f7fe170e1fe8eabeea',1,'cv::CAP_WINRT'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da92175615b64b63f7fe170e1fe8eabeea',1,'CAP_WINRT(Global Namespace)']]], + ['cap_5fwinrt_2ehpp_520',['cap_winrt.hpp',['https://docs.opencv.org/4.2.0/d7/d64/cap__winrt_8hpp.html',1,'']]], + ['cap_5fxiapi_521',['CAP_XIAPI',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da09a7f09167711d60cd98bb779154374b',1,'cv::CAP_XIAPI'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da09a7f09167711d60cd98bb779154374b',1,'CAP_XIAPI(Global Namespace)']]], + ['cap_5fxine_522',['CAP_XINE',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da5cc03d4fed01f175de71b3fd228a1ac3',1,'cv::CAP_XINE'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html#gga023786be1ee68a9105bf2e48c700294da5cc03d4fed01f175de71b3fd228a1ac3',1,'CAP_XINE(Global Namespace)']]], + ['capacity_523',['capacity',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a7875f908db08e3d0940ab928eb160268',1,'__gnu_cxx::__versa_string::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'__gnu_debug::basic_string::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< _CharT >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< _CharT, _Traits, _Allocator >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< char >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< char, char_traits< char >, _Byte_alloc >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< char_type, _Traits, _Alloc >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'basic_string< value_type >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'match_results< _Bi_iter >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbd70b5afd5d6a0b47dfe2e2ec491c07',1,'std::basic_string::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'std::match_results::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'std::vector::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< __diff_type >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _CharClassT >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _CharT >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _Cmpt >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _Node *, _Nodeptr_Alloc >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _RealType >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _State< _TraitsT::char_type > >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< _StringT >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< block_type, allocator_type >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< Catalog_info * >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< double >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< int >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< result_type >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< size_t >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< std::pair< _BiIter, int > >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< std::pair< _StateIdT, std::vector > >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< std::pair< _StrTransT, _StrTransT > >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< sub_match< _Bi_iter >, _Alloc >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::capacity()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aeec23a5238eb60cd3bb5ec960e9b430e',1,'vector< sub_match< _BiIter >, _Alloc >::capacity()']]], + ['capture_524',['Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'Face Detection in Video Capture'],['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'Image Processing for Video Capture']]], + ['capture_20gray_20code_20pattern_20tutorial_525',['Capture Gray code pattern tutorial',['https://docs.opencv.org/4.2.0/db/d56/tutorial_capture_graycode_pattern.html',1,'']]], + ['capture_20sinusoidal_20pattern_20tutorial_526',['Capture Sinusoidal pattern tutorial',['https://docs.opencv.org/4.2.0/d0/de8/tutorial_capture_sinusoidal_pattern.html',1,'']]], + ['capture_5fpattern_2emarkdown_527',['capture_pattern.markdown',['https://docs.opencv.org/4.2.0/d5/df3/capture__pattern_8markdown.html',1,'']]], + ['capturesession_528',['captureSession',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#adb4a93417ac810225829d95718b15187',1,'CvAbstractCamera']]], + ['capturesessionloaded_529',['captureSessionLoaded',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a0433c6ce2417ab9f6ab3bcb6bf4914e5',1,'CvAbstractCamera']]], + ['capturesinpattern_2emarkdown_530',['capturesinpattern.markdown',['https://docs.opencv.org/4.2.0/d4/d9d/capturesinpattern_8markdown.html',1,'']]], + ['capturevideopreviewlayer_531',['captureVideoPreviewLayer',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#ab2584923d445cacd3f1bf37bc917a260',1,'CvAbstractCamera']]], + ['carttopolar_532',['cartToPolar',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gac5f92f48ec32cacf5275969c33ee837d',1,'cv::cartToPolar()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga82210c7d1c1d42e616e554bf75a53480',1,'cv::cuda::cartToPolar()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga3e20a87f89b397c27a9a8bfd57ff0180',1,'cv::gapi::cartToPolar()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gac5f92f48ec32cacf5275969c33ee837d',1,'cartToPolar(InputArray x, InputArray y, OutputArray magnitude, OutputArray angle, bool angleInDegrees=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga3e20a87f89b397c27a9a8bfd57ff0180',1,'cartToPolar(const GMat &x, const GMat &y, bool angleInDegrees=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga82210c7d1c1d42e616e554bf75a53480',1,'cartToPolar(InputArray x, InputArray y, OutputArray magnitude, OutputArray angle, bool angleInDegrees=false, Stream &stream=Stream::Null())(Global Namespace)']]], + ['cascade_533',['cascade',['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html#a67f72702a442dc214313897a8818a39e',1,'cv::face::CParams']]], + ['cascade_20classifier_534',['Cascade Classifier',['https://docs.opencv.org/4.2.0/db/d28/tutorial_cascade_classifier.html',1,'']]], + ['cascade_20classifier_20training_535',['Cascade Classifier Training',['https://docs.opencv.org/4.2.0/dc/d88/tutorial_traincascade.html',1,'']]], + ['cascade_5fclassifier_2emarkdown_536',['cascade_classifier.markdown',['https://docs.opencv.org/4.2.0/d0/d98/cascade__classifier_8markdown.html',1,'']]], + ['cascade_5fdepth_537',['cascade_depth',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#af9e428c04035a663477ff6e72f15eadc',1,'cv::face::FacemarkKazemi::Params']]], + ['cascade_5fdo_5fcanny_5fpruning_538',['CASCADE_DO_CANNY_PRUNING',['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a04a050084d81a4a05abe92b7fc9ef210',1,'cv::CASCADE_DO_CANNY_PRUNING'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a04a050084d81a4a05abe92b7fc9ef210',1,'CASCADE_DO_CANNY_PRUNING(Global Namespace)']]], + ['cascade_5fdo_5frough_5fsearch_539',['CASCADE_DO_ROUGH_SEARCH',['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a54f9abc96125f942117c847bc8fa9b83',1,'cv::CASCADE_DO_ROUGH_SEARCH'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a54f9abc96125f942117c847bc8fa9b83',1,'CASCADE_DO_ROUGH_SEARCH(Global Namespace)']]], + ['cascade_5fface_540',['cascade_face',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a1ec6e46789b622a7b05c3f9df0053328',1,'cv::face::FacemarkLBF::Params']]], + ['cascade_5ffind_5fbiggest_5fobject_541',['CASCADE_FIND_BIGGEST_OBJECT',['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a3ecc6a38e196bd80afb57ac7b116c7fc',1,'cv::CASCADE_FIND_BIGGEST_OBJECT'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a3ecc6a38e196bd80afb57ac7b116c7fc',1,'CASCADE_FIND_BIGGEST_OBJECT(Global Namespace)']]], + ['cascade_5fscale_5fimage_542',['CASCADE_SCALE_IMAGE',['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a1d35c5234686c05c075d224efc91d673',1,'cv::CASCADE_SCALE_IMAGE'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ggada3c4e6ca936e43ff390e61b5629cfd8a1d35c5234686c05c075d224efc91d673',1,'CASCADE_SCALE_IMAGE(Global Namespace)']]], + ['cascadeclassifier_543',['CascadeClassifier',['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html',1,'cv::CascadeClassifier'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html',1,'cv::cuda::CascadeClassifier'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#ab3e572643114c43b21074df48c565a27',1,'cv::CascadeClassifier::CascadeClassifier()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a6d01a748b103f0cd6bd2a20037ae8731',1,'cv::CascadeClassifier::CascadeClassifier(const String &filename)']]], + ['cascadefortracking_544',['cascadeForTracking',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a139b62b2435087f6ef6527b75f69a751',1,'cv::DetectionBasedTracker']]], + ['cascades_545',['Cascades',['https://docs.opencv.org/4.2.0/d7/d8b/tutorial_py_face_detection.html',1,'Face Detection using Haar Cascades'],['https://docs.opencv.org/4.2.0/d2/d99/tutorial_js_face_detection.html',1,'Face Detection using Haar Cascades']]], + ['cassert_546',['cassert',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00185.html',1,'']]], + ['cast_547',['cast',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a0e9ce77d38d4f5c4060a7b2df93df42a',1,'cv::Affine3::cast()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a0e9ce77d38d4f5c4060a7b2df93df42a',1,'Affine3< float >::cast()'],['https://docs.opencv.org/4.2.0/d2/d31/structcv_1_1cudev_1_1vec__math__detail_1_1SatCastHelper_3_011_00_01VecD_01_4.html#a96a5b2c56618ae4fc9d68d9bc1bd4a88',1,'cv::cudev::vec_math_detail::SatCastHelper< 1, VecD >::cast()'],['https://docs.opencv.org/4.2.0/dc/dbc/structcv_1_1cudev_1_1vec__math__detail_1_1SatCastHelper_3_012_00_01VecD_01_4.html#a8ff7715f17712bb9b22c42246d75c5be',1,'cv::cudev::vec_math_detail::SatCastHelper< 2, VecD >::cast()'],['https://docs.opencv.org/4.2.0/d8/dbe/structcv_1_1cudev_1_1vec__math__detail_1_1SatCastHelper_3_013_00_01VecD_01_4.html#a732bd39cf56650c63cc4bb82f13e839d',1,'cv::cudev::vec_math_detail::SatCastHelper< 3, VecD >::cast()'],['https://docs.opencv.org/4.2.0/df/d18/structcv_1_1cudev_1_1vec__math__detail_1_1SatCastHelper_3_014_00_01VecD_01_4.html#a10e25561501945f78fca30f4738cfd16',1,'cv::cudev::vec_math_detail::SatCastHelper< 4, VecD >::cast()'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#a2a5fefa22cb5b69971c3eff8854fe6c7',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cv::viz::Widget::cast() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a5b867bc4a02f78d7feaf45eaaa6f5484',1,'Eigen::AlignedBox::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a566d3231bd0e209469ab8ee37aada6a4',1,'Eigen::AngleAxis::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#acfeb7c6af0d9cedb04a4a4268948f015',1,'Eigen::Hyperplane::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#acd906e5340b05a41e098496aa861e5a5',1,'Eigen::ParametrizedLine::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a951d627764be63ca1e8c2c4c7315e43f',1,'Eigen::QuaternionBase::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a951d627764be63ca1e8c2c4c7315e43f',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a951d627764be63ca1e8c2c4c7315e43f',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a951d627764be63ca1e8c2c4c7315e43f',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a66445e2faf7f98d535fd5a8bf0a974e1',1,'Eigen::Rotation2D::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a86a66867b2a9ee0c9c4e920baf2bdacd',1,'Eigen::Transform::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a6dda00ac348f3061cd501f2822d0e534',1,'Eigen::Translation::cast()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#af93a9ee1d6efc102b65a197f3ea3d4cd',1,'Eigen::UniformScaling::cast()'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#gac1429274175faaf3c07b7a7b7d8e325b',1,'cast() const(Global Namespace)']]], + ['cast_2eh_548',['cast.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01037.html',1,'']]], + ['cast_5ffp16_549',['cast_fp16',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d1fb7894d813ebf16e94899bc6b2f6a',1,'cv::cudev::cast_fp16()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d1fb7894d813ebf16e94899bc6b2f6a',1,'cast_fp16()(Global Namespace)']]], + ['cast_5ffp16_3c_20float_2c_20short_20_3e_550',['cast_fp16< float, short >',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99a700f4bbd52181d43bfdc6b5a3ebe5',1,'cv::cudev::cast_fp16< float, short >()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99a700f4bbd52181d43bfdc6b5a3ebe5',1,'cast_fp16< float, short >()(Global Namespace)']]], + ['cast_5ffp16_3c_20short_2c_20float_20_3e_551',['cast_fp16< short, float >',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dcd5add77bb51d0047da95199df56f8',1,'cv::cudev::cast_fp16< short, float >()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dcd5add77bb51d0047da95199df56f8',1,'cast_fp16< short, float >(short v)(Global Namespace)']]], + ['catalog_20of_20coefficient_20wise_20math_20functions_552',['Catalog of coefficient-wise math functions',['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'']]], + ['catalogue_20of_20dense_20decompositions_553',['Catalogue of dense decompositions',['https://eigen.tuxfamily.org/dox/group__TopicLinearAlgebraDecompositions.html',1,'']]], + ['categorization_554',['Object Categorization',['https://docs.opencv.org/4.2.0/de/d24/group__features2d__category.html',1,'']]], + ['category_555',['category',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a969b15053ff1b296935ea2dff07afad5',1,'std::locale']]], + ['cauchy_5fdistribution_556',['cauchy_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html',1,'std']]], + ['causing_20optical_20illusions_557',['Processing images causing optical illusions',['https://docs.opencv.org/4.2.0/d7/d8f/tutorial_bioinspired_retina_illusion.html',1,'']]], + ['cbefore_5fbegin_558',['cbefore_begin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a8e747964c0b29e83f50020110f4b1d72',1,'std::forward_list']]], + ['cbegin_559',['cbegin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#acd9303d9a1eea900367172706bbea0fc',1,'__gnu_cxx::__versa_string::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< _CharT >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< _CharT, _Traits, _Allocator >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< char >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< char, char_traits< char >, _Byte_alloc >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< char_type, _Traits, _Alloc >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'basic_string< value_type >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a289af3aac006b9faa969fbdf090f8202',1,'deque< _StateSeqT >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aac9c52d90a45482d052dbb4b2040b6da',1,'list< __inp, __rebind_inp >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a785d55284f022fd44b5cb192aaaac850',1,'match_results< _Bi_iter >::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a785d55284f022fd44b5cb192aaaac850',1,'match_results< _Bi_iter >::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#accd90e0fb247fa817e4b8e2b093380aa',1,'std::basic_string::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a289af3aac006b9faa969fbdf090f8202',1,'std::deque::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ace31decae76d75133e08418f392a78b3',1,'std::forward_list::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aac9c52d90a45482d052dbb4b2040b6da',1,'std::list::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#af11167910bc728cbeb7997b7e8bd8326',1,'std::map::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a785d55284f022fd44b5cb192aaaac850',1,'std::match_results::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a749c6f97a0d9ecc3fa8810bc2452291d',1,'std::multimap::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a47de6fecee69e70e8e20f69e31774708',1,'std::multiset::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a39e7d303fb234db62a1faa6df63f4604',1,'std::set::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af9610ba94f6f17e7af50d7280638fa17',1,'std::unordered_map::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a326f910adabc220031b93dc6b472b913',1,'std::unordered_map::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af9610ba94f6f17e7af50d7280638fa17',1,'std::unordered_map::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a326f910adabc220031b93dc6b472b913',1,'std::unordered_map::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ae1c99977950ad720b2b10f6daf6c31ab',1,'std::unordered_multimap::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ad4f2132ee625dc5b3a48d28a495d552f',1,'std::unordered_multimap::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ae1c99977950ad720b2b10f6daf6c31ab',1,'std::unordered_multimap::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ad4f2132ee625dc5b3a48d28a495d552f',1,'std::unordered_multimap::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a8fefcc1326d2d85a00bf958f7086d4a1',1,'std::unordered_multiset::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af211aacc4102c0ceb0814dd6c518e8ed',1,'std::unordered_multiset::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af211aacc4102c0ceb0814dd6c518e8ed',1,'std::unordered_multiset::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a4bc73af25660f155f196c73298073f27',1,'std::unordered_set::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a30a15b1c31e75c9cfd56a4b3f24fe1ce',1,'std::unordered_set::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a30a15b1c31e75c9cfd56a4b3f24fe1ce',1,'std::unordered_set::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'std::vector::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af9610ba94f6f17e7af50d7280638fa17',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a326f910adabc220031b93dc6b472b913',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af9610ba94f6f17e7af50d7280638fa17',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cbegin() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a326f910adabc220031b93dc6b472b913',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cbegin(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< __diff_type >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _CharClassT >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _CharT >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _Cmpt >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _Node *, _Nodeptr_Alloc >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _RealType >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _State< _TraitsT::char_type > >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< _StringT >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< block_type, allocator_type >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< Catalog_info * >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< double >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< int >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< result_type >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< size_t >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< std::pair< _BiIter, int > >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< std::pair< _StateIdT, std::vector > >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< std::pair< _StrTransT, _StrTransT > >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< sub_match< _Bi_iter >, _Alloc >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aa5ce64abecf486fbdb7914ae9734d289',1,'vector< sub_match< _BiIter >, _Alloc >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae9a3dfd9b826ba3103de0128576fb15b',1,'Eigen::DenseBase::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae9a3dfd9b826ba3103de0128576fb15b',1,'DenseBase< ArrayWrapper< ExpressionType > >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae9a3dfd9b826ba3103de0128576fb15b',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae9a3dfd9b826ba3103de0128576fb15b',1,'DenseBase< Solve< Decomposition, RhsType > >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'Eigen::VectorwiseOp::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const Derived, Horizontal >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const Derived, Vertical >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::cbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7b237a2b46479de5c905d2bcc54f34c4',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::cbegin()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ae508c13e3ad6ce445bcaf24a2bc7d039.html#ae508c13e3ad6ce445bcaf24a2bc7d039',1,'nlohmann::basic_json::cbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac10e18b5c09f39bc07430a9d47e584a5',1,'std::cbegin()']]], + ['cbor_5ftag_5fhandler_5ft_560',['cbor_tag_handler_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a54951d14f0dd10cc3cfdaa24f8bfd15c.html#a54951d14f0dd10cc3cfdaa24f8bfd15c',1,'nlohmann::basic_json']]], + ['cbrt_561',['cbrt',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac8f04998be778e95f591ae789e7d6578',1,'cv::cbrt()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac8f04998be778e95f591ae789e7d6578',1,'cbrt()(Global Namespace)']]], + ['cc_562',['cc',['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a028c1d86a8275c82b089510768f853bd',1,'cv::CascadeClassifier']]], + ['cc_5fhash_5fmax_5fcollision_5fcheck_5fresize_5ftrigger_563',['cc_hash_max_collision_check_resize_trigger',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger< External_Load_Access, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#a3570f81e8bebfa7c217839b679c1692c',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::cc_hash_max_collision_check_resize_trigger()']]], + ['cc_5fhash_5fmax_5fcollision_5fcheck_5fresize_5ftrigger_5fimp_2ehpp_564',['cc_hash_max_collision_check_resize_trigger_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01400.html',1,'']]], + ['cc_5fhash_5ftable_565',['cc_hash_table',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html',1,'__gnu_pbds::cc_hash_table< class, class, class, class, class, class, Store_Hash, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a5bb84ecde74cb41964822f5d7cce74e1',1,'__gnu_pbds::cc_hash_table::cc_hash_table()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#ae82fe7fcb8c0975de60e6fa15ce95085',1,'__gnu_pbds::cc_hash_table::cc_hash_table(const hash_fn &h)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a27bdb924e2946488ec465fcacde15e21',1,'__gnu_pbds::cc_hash_table::cc_hash_table(const hash_fn &h, const eq_fn &e)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a2f83d8a3065813574b512ebbf8437447',1,'__gnu_pbds::cc_hash_table::cc_hash_table(const hash_fn &h, const eq_fn &e, const comb_hash_fn &ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#af141c65bc358d5c20b19adfe317ad7ac',1,'__gnu_pbds::cc_hash_table::cc_hash_table(const hash_fn &h, const eq_fn &e, const comb_hash_fn &ch, const resize_policy &rp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a70bcd64a9cb68398c169151c36365be9',1,'__gnu_pbds::cc_hash_table::cc_hash_table(It first, It last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a406cabdd8523a7b910875ce4ecce1cbc',1,'__gnu_pbds::cc_hash_table::cc_hash_table(It first, It last, const hash_fn &h)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a824df817359f701b3d157ed8638d4528',1,'__gnu_pbds::cc_hash_table::cc_hash_table(It first, It last, const hash_fn &h, const eq_fn &e)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a1bca4b04926462c9f409b902ebb0b397',1,'__gnu_pbds::cc_hash_table::cc_hash_table(It first, It last, const hash_fn &h, const eq_fn &e, const comb_hash_fn &ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11103.html#a2ffb9ad5d7b0bdde4f5e079ed3c0a6a5',1,'__gnu_pbds::cc_hash_table::cc_hash_table(It first, It last, const hash_fn &h, const eq_fn &e, const comb_hash_fn &ch, const resize_policy &rp)']]], + ['cc_5fhash_5ftable_5fmap_5f_2fconstructor_5fdestructor_5ffn_5fimps_2ehpp_566',['cc_hash_table_map_/constructor_destructor_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16661.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2fconstructor_5fdestructor_5fno_5fstore_5fhash_5ffn_5fimps_2ehpp_567',['cc_hash_table_map_/constructor_destructor_no_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16670.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2fconstructor_5fdestructor_5fstore_5fhash_5ffn_5fimps_2ehpp_568',['cc_hash_table_map_/constructor_destructor_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16676.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2fdebug_5ffn_5fimps_2ehpp_569',['cc_hash_table_map_/debug_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16757.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2fdebug_5fno_5fstore_5fhash_5ffn_5fimps_2ehpp_570',['cc_hash_table_map_/debug_no_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16790.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2fdebug_5fstore_5fhash_5ffn_5fimps_2ehpp_571',['cc_hash_table_map_/debug_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16796.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2ferase_5ffn_5fimps_2ehpp_572',['cc_hash_table_map_/erase_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16820.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2ferase_5fno_5fstore_5fhash_5ffn_5fimps_2ehpp_573',['cc_hash_table_map_/erase_no_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16853.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2ferase_5fstore_5fhash_5ffn_5fimps_2ehpp_574',['cc_hash_table_map_/erase_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16859.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2ffind_5ffn_5fimps_2ehpp_575',['cc_hash_table_map_/find_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16874.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2ffind_5fstore_5fhash_5ffn_5fimps_2ehpp_576',['cc_hash_table_map_/find_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16898.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2finfo_5ffn_5fimps_2ehpp_577',['cc_hash_table_map_/info_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16955.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2finsert_5ffn_5fimps_2ehpp_578',['cc_hash_table_map_/insert_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16988.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2finsert_5fno_5fstore_5fhash_5ffn_5fimps_2ehpp_579',['cc_hash_table_map_/insert_no_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17018.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2finsert_5fstore_5fhash_5ffn_5fimps_2ehpp_580',['cc_hash_table_map_/insert_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17024.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2fiterators_5ffn_5fimps_2ehpp_581',['cc_hash_table_map_/iterators_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17042.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2fpolicy_5faccess_5ffn_5fimps_2ehpp_582',['cc_hash_table_map_/policy_access_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17150.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2fresize_5ffn_5fimps_2ehpp_583',['cc_hash_table_map_/resize_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17189.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2fresize_5fno_5fstore_5fhash_5ffn_5fimps_2ehpp_584',['cc_hash_table_map_/resize_no_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17195.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2fresize_5fstore_5fhash_5ffn_5fimps_2ehpp_585',['cc_hash_table_map_/resize_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17201.html',1,'']]], + ['cc_5fhash_5ftable_5fmap_5f_2ftrace_5ffn_5fimps_2ehpp_586',['cc_hash_table_map_/trace_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17285.html',1,'']]], + ['cc_5fhash_5ftag_587',['cc_hash_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11227.html',1,'__gnu_pbds']]], + ['cc_5fht_5fmap_588',['cc_ht_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11671.html',1,'__gnu_pbds::detail']]], + ['cc_5fht_5fmap_5f_2ehpp_589',['cc_ht_map_.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01241.html',1,'']]], + ['cc_5fstat_5farea_590',['CC_STAT_AREA',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a49573cd2ef1510fd96052d94feaac901',1,'cv::CC_STAT_AREA'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a49573cd2ef1510fd96052d94feaac901',1,'CC_STAT_AREA(Global Namespace)']]], + ['cc_5fstat_5fheight_591',['CC_STAT_HEIGHT',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a9b2a516b764fd4a35c8513ce0bc9c570',1,'cv::CC_STAT_HEIGHT'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a9b2a516b764fd4a35c8513ce0bc9c570',1,'CC_STAT_HEIGHT(Global Namespace)']]], + ['cc_5fstat_5fleft_592',['CC_STAT_LEFT',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a04bf79427482a254e98c546080c89479',1,'cv::CC_STAT_LEFT'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a04bf79427482a254e98c546080c89479',1,'CC_STAT_LEFT(Global Namespace)']]], + ['cc_5fstat_5ftop_593',['CC_STAT_TOP',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a5dcf5ad1fb02f810023ce2d4148abb09',1,'cv::CC_STAT_TOP'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5a5dcf5ad1fb02f810023ce2d4148abb09',1,'CC_STAT_TOP(Global Namespace)']]], + ['cc_5fstat_5fwidth_594',['CC_STAT_WIDTH',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5af747c3b07668e91a316945a70adcef59',1,'cv::CC_STAT_WIDTH'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggac7099124c0390051c6970a987e7dc5c5af747c3b07668e91a316945a70adcef59',1,'CC_STAT_WIDTH(Global Namespace)']]], + ['ccalib_2ehpp_595',['ccalib.hpp',['https://docs.opencv.org/4.2.0/d6/d01/ccalib_8hpp.html',1,'']]], + ['ccl_5fdefault_596',['CCL_DEFAULT',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga5ed7784614678adccb699c70fb841075abd210ad49e33f19f2cb8c090c11f7a4c',1,'cv::CCL_DEFAULT'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga5ed7784614678adccb699c70fb841075abd210ad49e33f19f2cb8c090c11f7a4c',1,'CCL_DEFAULT(Global Namespace)']]], + ['ccl_5fgrana_597',['CCL_GRANA',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga5ed7784614678adccb699c70fb841075a49eccb403b410391d5ff9048d30596f5',1,'cv::CCL_GRANA'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga5ed7784614678adccb699c70fb841075a49eccb403b410391d5ff9048d30596f5',1,'CCL_GRANA(Global Namespace)']]], + ['ccl_5fwu_598',['CCL_WU',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga5ed7784614678adccb699c70fb841075a612680db0d08d338109a6cd758417b66',1,'cv::CCL_WU'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga5ed7784614678adccb699c70fb841075a612680db0d08d338109a6cd758417b66',1,'CCL_WU(Global Namespace)']]], + ['ccomplex_599',['ccomplex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00188.html',1,'']]], + ['cctype_600',['cctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00191.html',1,'']]], + ['cdt_601',['Using OpenCV with Eclipse (plugin CDT)',['https://docs.opencv.org/4.2.0/d7/d16/tutorial_linux_eclipse.html',1,'']]], + ['ceil_602',['ceil',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#aa73e38be0689a463ae14141b9cf89c35',1,'Eigen']]], + ['ceild_603',['ceild',['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a80a01f26587bf79f0783ef5037443103',1,'cv::gapi::own']]], + ['ceilmode_604',['ceilMode',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a7b89590e0eb5c16450434eaa69e7d920',1,'cv::dnn::PoolingLayer']]], + ['celestial_5fblue_605',['celestial_blue',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a199c10be9ce1c87d0af38ff02320c87f',1,'cv::viz::Color']]], + ['cellsize_606',['cellSize',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a5ef930c38e2b0cfcd5e5252989e056ad',1,'cv::HOGDescriptor::cellSize'],['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#aad46eb46a2435cd013f2ad164c9129dd',1,'cv::videostab::TranslationBasedLocalOutlierRejector::cellSize()']]], + ['cellsz_607',['cellSz',['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html#ab149c78d0618f70523d04f61935fda3b',1,'cv::gapi::wip::draw::Mosaic']]], + ['cend_608',['cend',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a48e703791d3549f4e4c84af68b382f99',1,'__gnu_cxx::__versa_string::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< _CharT >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< _CharT, _Traits, _Allocator >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< char >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< char, char_traits< char >, _Byte_alloc >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< char_type, _Traits, _Alloc >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'basic_string< value_type >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ae56c2f3c25dc623eba9825a2e3eddd7c',1,'deque< _StateSeqT >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a702400622789c3e0f1171369f803fcb8',1,'list< __inp, __rebind_inp >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#adbf3f720ba82b5f146ca54e9db918d7f',1,'match_results< _Bi_iter >::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#adbf3f720ba82b5f146ca54e9db918d7f',1,'match_results< _Bi_iter >::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a08def895e3c355e7d463af3f778a0f52',1,'std::basic_string::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ae56c2f3c25dc623eba9825a2e3eddd7c',1,'std::deque::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aaa651df81ec5161454becd5198407986',1,'std::forward_list::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a702400622789c3e0f1171369f803fcb8',1,'std::list::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a512508ab8aef5dad73ae92751513769e',1,'std::map::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#adbf3f720ba82b5f146ca54e9db918d7f',1,'std::match_results::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ab07754c1ec76a0bc39a9210270d939a4',1,'std::multimap::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aa61090fd58e3795f2f87e341b27c1469',1,'std::multiset::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a5d2030f67826e8bfea0b6dce51e792b7',1,'std::set::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab862dadbaf3147cfc02bd383ed35e1f9',1,'std::unordered_map::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a786093f27f238f88c21ecbfe11e27981',1,'std::unordered_map::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab862dadbaf3147cfc02bd383ed35e1f9',1,'std::unordered_map::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a786093f27f238f88c21ecbfe11e27981',1,'std::unordered_map::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#acc5c6d3a39a12f7d21e8886534eaa591',1,'std::unordered_multimap::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aeabc377e8c2f5b367388ee5e4e0aff99',1,'std::unordered_multimap::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#acc5c6d3a39a12f7d21e8886534eaa591',1,'std::unordered_multimap::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aeabc377e8c2f5b367388ee5e4e0aff99',1,'std::unordered_multimap::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a2a6edd3b4b891c1c260d3001a6b1ffcb',1,'std::unordered_multiset::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#abae4214954f75b08215d74344bc81562',1,'std::unordered_multiset::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#abae4214954f75b08215d74344bc81562',1,'std::unordered_multiset::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a155f3d6e9b8a3a59bb03969355ae5f73',1,'std::unordered_set::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a5f19f51483e14e3006bf1d6c0c7ec00a',1,'std::unordered_set::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a5f19f51483e14e3006bf1d6c0c7ec00a',1,'std::unordered_set::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'std::vector::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab862dadbaf3147cfc02bd383ed35e1f9',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a786093f27f238f88c21ecbfe11e27981',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab862dadbaf3147cfc02bd383ed35e1f9',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cend() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a786093f27f238f88c21ecbfe11e27981',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::cend(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< __diff_type >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _CharClassT >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _CharT >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _Cmpt >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _Node *, _Nodeptr_Alloc >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _RealType >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _State< _TraitsT::char_type > >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< _StringT >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< block_type, allocator_type >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< Catalog_info * >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< double >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< int >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< result_type >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< size_t >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< std::pair< _BiIter, int > >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< std::pair< _StateIdT, std::vector > >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< std::pair< _StrTransT, _StrTransT > >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< sub_match< _Bi_iter >, _Alloc >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae7e855d48dc6fc90c9f746d2098c263',1,'vector< sub_match< _BiIter >, _Alloc >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb3b76f02986c2af2521d07164b5ffde',1,'Eigen::DenseBase::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb3b76f02986c2af2521d07164b5ffde',1,'DenseBase< ArrayWrapper< ExpressionType > >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb3b76f02986c2af2521d07164b5ffde',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aeb3b76f02986c2af2521d07164b5ffde',1,'DenseBase< Solve< Decomposition, RhsType > >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'Eigen::VectorwiseOp::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const Derived, Horizontal >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const Derived, Vertical >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::cend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a57859b88a32b8b393a427c4cab3581a7',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::cend()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3017cf0f1a4673e904e34cfef62e7758.html#a3017cf0f1a4673e904e34cfef62e7758',1,'nlohmann::basic_json::cend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6cd5aaabed869c9d96801743fb4d7f6f',1,'std::cend()']]], + ['censuskernel_609',['CensusKernel',['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html',1,'cv::stereo::CensusKernel< num_images >'],['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html#ae649346d028b62eec41b6004187702d9',1,'cv::stereo::CensusKernel::CensusKernel()'],['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html#a2f555637644e6e4abd8d0d78340466c5',1,'cv::stereo::CensusKernel::CensusKernel(uint8_t **images)']]], + ['censustransform_610',['censusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a939dfbb1a0d1a3255749629343247bd5',1,'cv::stereo::censusTransform(const cv::Mat &image1, const cv::Mat &image2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2, const int type)'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#aa1a856f429cd2359d65cef9e1a60cb03',1,'cv::stereo::censusTransform(const cv::Mat &image1, int kernelSize, cv::Mat &dist1, const int type)']]], + ['center_611',['center',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#a8c6746073f8c0c4c2490a55bf3de8abf',1,'cv::gapi::wip::draw::Circle::center'],['https://docs.opencv.org/4.2.0/db/dd6/classcv_1_1RotatedRect.html#a60d492fbe1e457e2cdeac5160ed81422',1,'cv::RotatedRect::center']]], + ['central_5fmoments_612',['central_moments',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#af0f94a7b3ef144f5d831cdbf7c2ea842',1,'cv::text::ERStat']]], + ['cerr_613',['cerr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7431d56d1e8cd7a9b854171294bd71c7',1,'std::cerr'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7431d56d1e8cd7a9b854171294bd71c7',1,'std::cerr']]], + ['cerrno_614',['cerrno',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00194.html',1,'']]], + ['cfenv_615',['cfenv',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00197.html',1,'']]], + ['cfginputlayers_616',['cfgInputLayers',['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#aecac9f8f2339cf4ad732305e711c6f24',1,'cv::gapi::ie::Params']]], + ['cfgoutputlayers_617',['cfgOutputLayers',['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#a9a77772618784d0f7dc30e85f586cb3b',1,'cv::gapi::ie::Params']]], + ['cfloat_618',['cfloat',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00200.html',1,'']]], + ['chain_5fapprox_5fnone_619',['CHAIN_APPROX_NONE',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffaf7d9a3582d021d5dadcb0e37201a62f8',1,'cv::CHAIN_APPROX_NONE'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffaf7d9a3582d021d5dadcb0e37201a62f8',1,'CHAIN_APPROX_NONE(Global Namespace)']]], + ['chain_5fapprox_5fsimple_620',['CHAIN_APPROX_SIMPLE',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffa5f2883048e654999209f88ba04c302f5',1,'cv::CHAIN_APPROX_SIMPLE'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffa5f2883048e654999209f88ba04c302f5',1,'CHAIN_APPROX_SIMPLE(Global Namespace)']]], + ['chain_5fapprox_5ftc89_5fkcos_621',['CHAIN_APPROX_TC89_KCOS',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffa867e7a9ab72c8199a60e2d595d1078a3',1,'cv::CHAIN_APPROX_TC89_KCOS'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffa867e7a9ab72c8199a60e2d595d1078a3',1,'CHAIN_APPROX_TC89_KCOS(Global Namespace)']]], + ['chain_5fapprox_5ftc89_5fl1_622',['CHAIN_APPROX_TC89_L1',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffad29171855734b1cf69fb6653c5d1db35',1,'cv::CHAIN_APPROX_TC89_L1'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffad29171855734b1cf69fb6653c5d1db35',1,'CHAIN_APPROX_TC89_L1(Global Namespace)']]], + ['chan_623',['chan',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a64432cfbe7c973d05e792640f9ddac69',1,'cv::GMatDesc']]], + ['changelog_624',['Face module changelog',['https://docs.opencv.org/4.2.0/d9/d47/face_changelog.html',1,'']]], + ['changelog_2emarkdown_625',['changelog.markdown',['https://docs.opencv.org/4.2.0/de/d0f/changelog_8markdown.html',1,'']]], + ['changestate_626',['changeState',['https://docs.opencv.org/4.2.0/dc/db4/structcv_1_1ml_1_1SimulatedAnnealingSolverSystem.html#a0132f0e32f2065c5ed72fd822538e939',1,'cv::ml::SimulatedAnnealingSolverSystem']]], + ['changing_20colorspaces_627',['Changing Colorspaces',['https://docs.opencv.org/4.2.0/df/d9d/tutorial_py_colorspaces.html',1,'Changing Colorspaces'],['https://docs.opencv.org/4.2.0/db/d64/tutorial_js_colorspaces.html',1,'Changing Colorspaces']]], + ['changing_20the_20contrast_20and_20brightness_20of_20an_20image_628',['Changing the contrast and brightness of an image!',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'']]], + ['channel_20composition_20functions_629',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], + ['channel_20merge_630',['Channel merge',['https://docs.opencv.org/4.2.0/df/d2e/group__core__hal__interface__merge.html',1,'']]], + ['channel_20split_631',['Channel split',['https://docs.opencv.org/4.2.0/df/df2/group__core__hal__interface__split.html',1,'']]], + ['channel_5ftype_632',['channel_type',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4c8d83a036ea24d2704c0727782a5963',1,'cv::Mat_::channel_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4c8d83a036ea24d2704c0727782a5963',1,'Mat_< double >::channel_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4c8d83a036ea24d2704c0727782a5963',1,'Mat_< float >::channel_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4c8d83a036ea24d2704c0727782a5963',1,'Mat_< uchar >::channel_type'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4c8d83a036ea24d2704c0727782a5963',1,'Mat_< unsigned char >::channel_type']]], + ['channels_633',['CHANNELS',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baae79bed6b59385fc169be9b668100c852',1,'cv::detail::ExposureCompensator']]], ['channels_634',['channels',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'cv::Matx::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< _Tp, cn, 1 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 1, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 2, 2 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 2, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 3, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 3, 4 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 4, 4 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, cn, 1 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< float, 2, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< float, 3, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< float, cn, 1 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< float_type, 4, 4 >::channels'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#a431c3759ea478a3fee9f53238b7e7844',1,'cv::cudev::SingleMaskChannels::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'cv::Vec::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< _Tp, 4 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, 2 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, 3 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, 4 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, GPCPatchDescriptor::nFeatures >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, nFeatures >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< float, 2 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< float, 3 >::channels'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#af198cb2bf572d2877185756a58b724f8',1,'cv::_InputArray::channels()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#ad124040681b94e05fc9030b087f49ab1',1,'cv::ogl::Buffer::channels()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a538fc6d75281b4ecb7ad50e4555f3fc6',1,'cv::cuda::GpuMat::channels()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a4d92401f4bbdf92721955c478fb2fea9',1,'cv::cudev::GpuMat_::channels()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a0de01702b003773e10207c0de0bf2730',1,'cv::cuda::HostMem::channels()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa11336b9ac538e0475d840657ce164be',1,'cv::Mat::channels()'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a35bba625657a85d6ccd38e8fa8624f75',1,'cv::gapi::own::Mat::channels()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab9ba3ea845d235bc1f74ab87b374392c',1,'cv::Mat_::channels()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab9ba3ea845d235bc1f74ab87b374392c',1,'Mat_< double >::channels()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab9ba3ea845d235bc1f74ab87b374392c',1,'Mat_< float >::channels()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab9ba3ea845d235bc1f74ab87b374392c',1,'Mat_< uchar >::channels()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab9ba3ea845d235bc1f74ab87b374392c',1,'Mat_< unsigned char >::channels()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#acb6b3b831a74b2071f8741ee873e925f',1,'cv::SparseMat::channels()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#af35ce086f94ecec24480d84010834737',1,'cv::SparseMat_::channels()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a58c1b68b2e355c044cf089c9156910c4',1,'cv::UMat::channels()']]], - ['channels_635',['CHANNELS',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baae79bed6b59385fc169be9b668100c852',1,'cv::detail::ExposureCompensator']]], - ['channels_5fblocks_636',['CHANNELS_BLOCKS',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baa3dc8b3fe16858c4c33cb5f928c25af38',1,'cv::detail::ExposureCompensator']]], - ['channelscompensator_637',['ChannelsCompensator',['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html',1,'cv::detail::ChannelsCompensator'],['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html#a82d0c3108d6bd9bd91f4f96424ce224a',1,'cv::detail::ChannelsCompensator::ChannelsCompensator()']]], - ['channelsprelulayer_638',['ChannelsPReLULayer',['https://docs.opencv.org/4.2.0/d7/de9/classcv_1_1dnn_1_1ChannelsPReLULayer.html',1,'cv::dnn']]], - ['char_5ftraits_639',['char_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05167.html',1,'__gnu_cxx::char_traits< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05171.html',1,'std::char_traits< class >']]], - ['char_5ftraits_2eh_640',['char_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00302.html',1,'']]], - ['char_5ftraits_3c_20_5f_5fgnu_5fcxx_3a_3acharacter_3c_20_5fvalue_2c_20_5fint_2c_20_5fst_20_3e_20_3e_641',['char_traits< __gnu_cxx::character< _Value, _Int, _St > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10535.html',1,'std']]], - ['char_5ftraits_3c_20char_20_3e_642',['char_traits< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05175.html',1,'std']]], - ['char_5ftraits_3c_20wchar_5ft_20_3e_643',['char_traits< wchar_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05179.html',1,'std']]], - ['char_5ftype_644',['char_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a6b04fb1c6b10871f93cd4f60d0f78f8d',1,'__ctype_abstract_base< wchar_t >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ab79c2147554ac3080647828e0bd75c17',1,'basic_ios< char, _Traits >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ab79c2147554ac3080647828e0bd75c17',1,'basic_ios< char, _Traits >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'basic_streambuf< _Elem, _Tr >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'basic_streambuf< _Elem, _Tr >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'basic_streambuf< char, _Traits >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'basic_streambuf< char, _Traits >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'basic_streambuf< char, char_traits< char > >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'basic_streambuf< char, char_traits< char > >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a6b04fb1c6b10871f93cd4f60d0f78f8d',1,'std::__ctype_abstract_base::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ab79c2147554ac3080647828e0bd75c17',1,'std::basic_ios::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ab79c2147554ac3080647828e0bd75c17',1,'std::basic_ios::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'std::basic_streambuf::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'std::basic_streambuf::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a8ad2844c921007521e36300507bcf8a2',1,'std::collate::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a8ad2844c921007521e36300507bcf8a2',1,'std::collate::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05899.html#aea2bc2caa0c7516b94a3a0a7513e9533',1,'std::collate_byname::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05899.html#aea2bc2caa0c7516b94a3a0a7513e9533',1,'std::collate_byname::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a28f3c847c9453a72212fdf3c2d186e4a',1,'std::ctype< char >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a77b824c31b28ab6ed3e78ee14b07de89',1,'std::ctype< wchar_t >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a28f3c847c9453a72212fdf3c2d186e4a',1,'std::ctype_byname< char >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#af460c7ea636315f32d360100cc25d939',1,'std::istreambuf_iterator::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#af460c7ea636315f32d360100cc25d939',1,'std::istreambuf_iterator::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a152bc75cd106bc26ad327391e34c1158',1,'std::messages::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a152bc75cd106bc26ad327391e34c1158',1,'std::messages::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a2274d956a1e68c2addf1acb24e80a82f',1,'std::money_get::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a2274d956a1e68c2addf1acb24e80a82f',1,'std::money_get::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#aa005c1e5eb9d1ccb7d282dbc18029ad1',1,'std::money_put::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#aa005c1e5eb9d1ccb7d282dbc18029ad1',1,'std::money_put::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#af3d40c8640263d9bbe03176598d04ccf',1,'std::moneypunct::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#af3d40c8640263d9bbe03176598d04ccf',1,'std::moneypunct::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a9a9a6afdb462d204cdc547b21a9ab994',1,'std::num_get::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a9a9a6afdb462d204cdc547b21a9ab994',1,'std::num_get::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ac0c51d4b707accaf08a924ea1e298ed9',1,'std::num_put::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ac0c51d4b707accaf08a924ea1e298ed9',1,'std::num_put::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a5f66a8c8a32a72ea0647e8d7cca7336f',1,'std::numpunct::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a5f66a8c8a32a72ea0647e8d7cca7336f',1,'std::numpunct::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a2e939ab7767bb87e13402127b3b0c841',1,'std::ostream_iterator::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a2e939ab7767bb87e13402127b3b0c841',1,'std::ostream_iterator::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ae17f1065063411a135cbbaea9430b4a1',1,'std::ostreambuf_iterator::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ae17f1065063411a135cbbaea9430b4a1',1,'std::ostreambuf_iterator::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a9c14489c5586486ba782d9fa30d8eaa4',1,'std::time_get::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a9c14489c5586486ba782d9fa30d8eaa4',1,'std::time_get::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a757828f8c32125500ce4a92c129913ec',1,'std::time_put::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a757828f8c32125500ce4a92c129913ec',1,'std::time_put::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'std::wbuffer_convert::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'std::wbuffer_convert::char_type']]], - ['character_645',['character',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10531.html',1,'__gnu_cxx']]], - ['chartreuse_646',['chartreuse',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#aa5a191c5f6e1f04fb1eb9c52c1da239e',1,'cv::viz::Color']]], - ['charuco_647',['Calibration with ArUco and ChArUco',['https://docs.opencv.org/4.2.0/da/d13/tutorial_aruco_calibration.html',1,'']]], - ['charuco_20corners_648',['Detection of ChArUco Corners',['https://docs.opencv.org/4.2.0/df/d4a/tutorial_charuco_detection.html',1,'']]], - ['charuco_2ehpp_649',['charuco.hpp',['https://docs.opencv.org/4.2.0/da/d3b/charuco_8hpp.html',1,'']]], - ['charuco_5fdetection_2emarkdown_650',['charuco_detection.markdown',['https://docs.opencv.org/4.2.0/d2/df7/charuco__detection_8markdown.html',1,'']]], - ['charuco_5fdiamond_5fdetection_2emarkdown_651',['charuco_diamond_detection.markdown',['https://docs.opencv.org/4.2.0/d8/d54/charuco__diamond__detection_8markdown.html',1,'']]], - ['charucoboard_652',['CharucoBoard',['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html',1,'cv::aruco']]], - ['cheb_5fattenuation_653',['cheb_attenuation',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a0ca99f8e69b5bf6cf7b399dee66aaa6b',1,'cv::TrackerCSRT::Params']]], - ['check_654',['check',['https://docs.opencv.org/4.2.0/dd/d16/classcv_1_1detail_1_1has__custom__wrap_1_1check.html',1,'cv::detail::has_custom_wrap::check< class, class >'],['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#ad6b244a52f3b90da6fc463341c8a486f',1,'cv::CommandLineParser::check()'],['https://docs.opencv.org/4.2.0/d1/dcc/structcv_1_1optflow_1_1GPCTrainingParams.html#a04484415fdb2e4522a197304d8773bde',1,'cv::optflow::GPCTrainingParams::check()'],['https://docs.opencv.org/4.2.0/d1/de5/structcv_1_1cudev_1_1IsBinaryFunction.html#a3be864a9c497fc8a58cac5aa8e5465eb',1,'cv::cudev::IsBinaryFunction::check(binary_function< T1, T2, D >)'],['https://docs.opencv.org/4.2.0/d1/de5/structcv_1_1cudev_1_1IsBinaryFunction.html#a0e4fd65fceffabea4e8d1f6148d9a681',1,'cv::cudev::IsBinaryFunction::check(...)'],['https://docs.opencv.org/4.2.0/d6/d82/structcv_1_1cudev_1_1IsUnaryFunction.html#a22f375dd1a1dca82324c69fc60861447',1,'cv::cudev::IsUnaryFunction::check(unary_function< T, D >)'],['https://docs.opencv.org/4.2.0/d6/d82/structcv_1_1cudev_1_1IsUnaryFunction.html#a6941577791fd0617b7a50bfe7cf4b7b2',1,'cv::cudev::IsUnaryFunction::check(...)']]], - ['check_20pnsr_20and_20ssim_20on_20the_20gpu_655',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], - ['check_2ehpp_656',['check.hpp',['https://docs.opencv.org/4.2.0/d1/d26/check_8hpp.html',1,'']]], - ['checkchessboard_657',['checkChessboard',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gacd8162cfd39138d0bc29e4b53d080673',1,'cv::checkChessboard()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gacd8162cfd39138d0bc29e4b53d080673',1,'checkChessboard()(Global Namespace)']]], - ['checkcudaerror_658',['checkCudaError',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga234cf847a51d5ca5ed42cc68a2ab64d9',1,'cv::cudev::checkCudaError()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga234cf847a51d5ca5ed42cc68a2ab64d9',1,'checkCudaError()(Global Namespace)']]], - ['checkdetectorsize_659',['checkDetectorSize',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a5c6715965fab466de041ad2a39765478',1,'cv::HOGDescriptor']]], - ['checkers_2eh_660',['checkers.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00884.html',1,'']]], - ['checkhardwaresupport_661',['checkHardwareSupport',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga83400136ccc28490087722ef5b3a27d9',1,'cv::checkHardwareSupport()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga83400136ccc28490087722ef5b3a27d9',1,'checkHardwareSupport()(Global Namespace)']]], - ['checkmasks_662',['checkMasks',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#acbcaa368465fd3924c8bb70851a98944',1,'cv::DescriptorMatcher']]], - ['checkoptimalvectorwidth_663',['checkOptimalVectorWidth',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga293c0b13a39f10465e3ea67a018d6779',1,'cv::ocl::checkOptimalVectorWidth()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga293c0b13a39f10465e3ea67a018d6779',1,'checkOptimalVectorWidth()(Global Namespace)']]], - ['checkparams_664',['checkParams',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a1dbd0738ac18917c29a226d893c1cf67',1,'cv::rgbd::FastICPOdometry::checkParams()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#aefeb1e17c0907f3a56f269559df1debf',1,'cv::rgbd::ICPOdometry::checkParams()'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#ac4fbc5da04bddaead526fd3470b5019b',1,'cv::rgbd::Odometry::checkParams()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a06f66c25c30dfa6ec51ec945f880eec9',1,'cv::rgbd::RgbdICPOdometry::checkParams()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a94c15a2233290ea8b6c5300ca0f39427',1,'cv::rgbd::RgbdOdometry::checkParams()']]], - ['checkrange_665',['checkRange',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga2bd19d89cae59361416736f87e3c7a64',1,'cv::checkRange()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga2bd19d89cae59361416736f87e3c7a64',1,'checkRange()(Global Namespace)']]], - ['checksubdiv_666',['checkSubdiv',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a2be088a8a411fc4dd232f18f7f88e736',1,'cv::Subdiv2D']]], - ['checkvector_667',['checkVector',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a167a8e0a3a3d86e84b70e33483af4466',1,'cv::Mat::checkVector()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a3d9972bea2e00ae4a8e2402dfdd5d99a',1,'cv::UMat::checkVector()']]], - ['cherry_668',['cherry',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#ac0fb905ab35ef2f14aa4dd65c1c10109',1,'cv::viz::Color']]], - ['chessboard_669',['Camera calibration with square chessboard',['https://docs.opencv.org/4.2.0/dc/d43/tutorial_camera_calibration_square_chess.html',1,'']]], - ['chessboardcorners_670',['chessboardCorners',['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html#a208edcbb778d3095cd5543660f6c4482',1,'cv::aruco::CharucoBoard']]], - ['chi2_671',['CHI2',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56a66a909b8add6114fde309d24483bcf82',1,'cv::ml::SVM']]], - ['chi_5fsquared_5fdistribution_672',['chi_squared_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html',1,'std']]], - ['chihistogramcostextractor_673',['ChiHistogramCostExtractor',['https://docs.opencv.org/4.2.0/dd/d43/classcv_1_1ChiHistogramCostExtractor.html',1,'cv']]], - ['child_674',['child',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a16d9f678b0d1822926c28f8db914b8cb',1,'cv::text::ERStat']]], - ['cholesky_675',['Cholesky',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gab39ce257149bdae7f9552e05c05c7642',1,'cv::Cholesky(float *A, size_t astep, int m, float *b, size_t bstep, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gac8d860b8a49bf2ed304b1c82acb916e5',1,'cv::Cholesky(double *A, size_t astep, int m, double *b, size_t bstep, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gab39ce257149bdae7f9552e05c05c7642',1,'Cholesky(float *A, size_t astep, int m, float *b, size_t bstep, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gac8d860b8a49bf2ed304b1c82acb916e5',1,'Cholesky(double *A, size_t astep, int m, double *b, size_t bstep, int n)(Global Namespace)']]], - ['cholesky_20matrix_20decomposition_676',['Cholesky matrix decomposition',['https://docs.opencv.org/4.2.0/d8/d0e/group__core__hal__interface__decomp__cholesky.html',1,'']]], - ['cholesky_20module_677',['Cholesky module',['https://eigen.tuxfamily.org/dox/group__Cholesky__Module.html',1,'']]], - ['cholesky32f_678',['Cholesky32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga511583d8e86bf1156a380207bae1708e',1,'cv::hal::Cholesky32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga511583d8e86bf1156a380207bae1708e',1,'Cholesky32f()(Global Namespace)']]], - ['cholesky64f_679',['Cholesky64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaeace96de6b7ecfa535b9e13a14a20bcb',1,'cv::hal::Cholesky64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaeace96de6b7ecfa535b9e13a14a20bcb',1,'Cholesky64f()(Global Namespace)']]], - ['cholmod_680',['cholmod',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a6a85bf52d6aa480240a64f277d7f96c6',1,'Eigen::CholmodBase::cholmod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a6a85bf52d6aa480240a64f277d7f96c6',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::cholmod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a6a85bf52d6aa480240a64f277d7f96c6',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::cholmod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a6a85bf52d6aa480240a64f277d7f96c6',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::cholmod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a6a85bf52d6aa480240a64f277d7f96c6',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::cholmod()']]], - ['cholmodbase_681',['CholmodBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html',1,'Eigen']]], - ['cholmodbase_3c_20_5fmatrixtype_2c_20lower_2c_20cholmoddecomposition_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_682',['CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html',1,'']]], - ['cholmodbase_3c_20_5fmatrixtype_2c_20lower_2c_20cholmodsimplicialldlt_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_683',['CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html',1,'']]], - ['cholmodbase_3c_20_5fmatrixtype_2c_20lower_2c_20cholmodsimplicialllt_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_684',['CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html',1,'']]], - ['cholmodbase_3c_20_5fmatrixtype_2c_20lower_2c_20cholmodsupernodalllt_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_685',['CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html',1,'']]], - ['cholmodcommon_686',['cholmodCommon',['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a64761b06dec908b81506c0c2619cd290',1,'Eigen::SPQR']]], - ['cholmoddecomposition_687',['CholmodDecomposition',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodDecomposition.html',1,'Eigen']]], - ['cholmodsimplicialldlt_688',['CholmodSimplicialLDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodSimplicialLDLT.html',1,'Eigen']]], - ['cholmodsimplicialllt_689',['CholmodSimplicialLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodSimplicialLLT.html',1,'Eigen']]], - ['cholmodsupernodalllt_690',['CholmodSupernodalLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodSupernodalLLT.html',1,'Eigen']]], - ['cholmodsupport_20module_691',['CholmodSupport module',['https://eigen.tuxfamily.org/dox/group__CholmodSupport__Module.html',1,'']]], + ['channels_5fblocks_635',['CHANNELS_BLOCKS',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baa3dc8b3fe16858c4c33cb5f928c25af38',1,'cv::detail::ExposureCompensator']]], + ['channelscompensator_636',['ChannelsCompensator',['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html',1,'cv::detail::ChannelsCompensator'],['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html#a82d0c3108d6bd9bd91f4f96424ce224a',1,'cv::detail::ChannelsCompensator::ChannelsCompensator()']]], + ['channelsprelulayer_637',['ChannelsPReLULayer',['https://docs.opencv.org/4.2.0/d7/de9/classcv_1_1dnn_1_1ChannelsPReLULayer.html',1,'cv::dnn']]], + ['char_5ftraits_638',['char_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05167.html',1,'__gnu_cxx::char_traits< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05171.html',1,'std::char_traits< class >']]], + ['char_5ftraits_2eh_639',['char_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00302.html',1,'']]], + ['char_5ftraits_3c_20_5f_5fgnu_5fcxx_3a_3acharacter_3c_20_5fvalue_2c_20_5fint_2c_20_5fst_20_3e_20_3e_640',['char_traits< __gnu_cxx::character< _Value, _Int, _St > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10535.html',1,'std']]], + ['char_5ftraits_3c_20char_20_3e_641',['char_traits< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05175.html',1,'std']]], + ['char_5ftraits_3c_20wchar_5ft_20_3e_642',['char_traits< wchar_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05179.html',1,'std']]], + ['char_5ftype_643',['char_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a6b04fb1c6b10871f93cd4f60d0f78f8d',1,'__ctype_abstract_base< wchar_t >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ab79c2147554ac3080647828e0bd75c17',1,'basic_ios< char, _Traits >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ab79c2147554ac3080647828e0bd75c17',1,'basic_ios< char, _Traits >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'basic_streambuf< _Elem, _Tr >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'basic_streambuf< _Elem, _Tr >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'basic_streambuf< char, _Traits >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'basic_streambuf< char, _Traits >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'basic_streambuf< char, char_traits< char > >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'basic_streambuf< char, char_traits< char > >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a6b04fb1c6b10871f93cd4f60d0f78f8d',1,'std::__ctype_abstract_base::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ab79c2147554ac3080647828e0bd75c17',1,'std::basic_ios::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#ab79c2147554ac3080647828e0bd75c17',1,'std::basic_ios::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'std::basic_streambuf::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'std::basic_streambuf::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a8ad2844c921007521e36300507bcf8a2',1,'std::collate::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a8ad2844c921007521e36300507bcf8a2',1,'std::collate::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05899.html#aea2bc2caa0c7516b94a3a0a7513e9533',1,'std::collate_byname::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05899.html#aea2bc2caa0c7516b94a3a0a7513e9533',1,'std::collate_byname::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a28f3c847c9453a72212fdf3c2d186e4a',1,'std::ctype< char >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a77b824c31b28ab6ed3e78ee14b07de89',1,'std::ctype< wchar_t >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a28f3c847c9453a72212fdf3c2d186e4a',1,'std::ctype_byname< char >::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#af460c7ea636315f32d360100cc25d939',1,'std::istreambuf_iterator::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#af460c7ea636315f32d360100cc25d939',1,'std::istreambuf_iterator::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a152bc75cd106bc26ad327391e34c1158',1,'std::messages::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a152bc75cd106bc26ad327391e34c1158',1,'std::messages::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a2274d956a1e68c2addf1acb24e80a82f',1,'std::money_get::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a2274d956a1e68c2addf1acb24e80a82f',1,'std::money_get::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#aa005c1e5eb9d1ccb7d282dbc18029ad1',1,'std::money_put::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#aa005c1e5eb9d1ccb7d282dbc18029ad1',1,'std::money_put::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#af3d40c8640263d9bbe03176598d04ccf',1,'std::moneypunct::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#af3d40c8640263d9bbe03176598d04ccf',1,'std::moneypunct::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a9a9a6afdb462d204cdc547b21a9ab994',1,'std::num_get::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a9a9a6afdb462d204cdc547b21a9ab994',1,'std::num_get::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ac0c51d4b707accaf08a924ea1e298ed9',1,'std::num_put::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#ac0c51d4b707accaf08a924ea1e298ed9',1,'std::num_put::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a5f66a8c8a32a72ea0647e8d7cca7336f',1,'std::numpunct::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a5f66a8c8a32a72ea0647e8d7cca7336f',1,'std::numpunct::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a2e939ab7767bb87e13402127b3b0c841',1,'std::ostream_iterator::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a2e939ab7767bb87e13402127b3b0c841',1,'std::ostream_iterator::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ae17f1065063411a135cbbaea9430b4a1',1,'std::ostreambuf_iterator::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ae17f1065063411a135cbbaea9430b4a1',1,'std::ostreambuf_iterator::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a9c14489c5586486ba782d9fa30d8eaa4',1,'std::time_get::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a9c14489c5586486ba782d9fa30d8eaa4',1,'std::time_get::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a757828f8c32125500ce4a92c129913ec',1,'std::time_put::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a757828f8c32125500ce4a92c129913ec',1,'std::time_put::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'std::wbuffer_convert::char_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a38ad1721a50a96c7d37d51a3f858a0cf',1,'std::wbuffer_convert::char_type']]], + ['character_644',['character',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10531.html',1,'__gnu_cxx']]], + ['chartreuse_645',['chartreuse',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#aa5a191c5f6e1f04fb1eb9c52c1da239e',1,'cv::viz::Color']]], + ['charuco_646',['Calibration with ArUco and ChArUco',['https://docs.opencv.org/4.2.0/da/d13/tutorial_aruco_calibration.html',1,'']]], + ['charuco_20corners_647',['Detection of ChArUco Corners',['https://docs.opencv.org/4.2.0/df/d4a/tutorial_charuco_detection.html',1,'']]], + ['charuco_2ehpp_648',['charuco.hpp',['https://docs.opencv.org/4.2.0/da/d3b/charuco_8hpp.html',1,'']]], + ['charuco_5fdetection_2emarkdown_649',['charuco_detection.markdown',['https://docs.opencv.org/4.2.0/d2/df7/charuco__detection_8markdown.html',1,'']]], + ['charuco_5fdiamond_5fdetection_2emarkdown_650',['charuco_diamond_detection.markdown',['https://docs.opencv.org/4.2.0/d8/d54/charuco__diamond__detection_8markdown.html',1,'']]], + ['charucoboard_651',['CharucoBoard',['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html',1,'cv::aruco']]], + ['cheb_5fattenuation_652',['cheb_attenuation',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a0ca99f8e69b5bf6cf7b399dee66aaa6b',1,'cv::TrackerCSRT::Params']]], + ['check_653',['check',['https://docs.opencv.org/4.2.0/dd/d16/classcv_1_1detail_1_1has__custom__wrap_1_1check.html',1,'cv::detail::has_custom_wrap::check< class, class >'],['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#ad6b244a52f3b90da6fc463341c8a486f',1,'cv::CommandLineParser::check()'],['https://docs.opencv.org/4.2.0/d1/dcc/structcv_1_1optflow_1_1GPCTrainingParams.html#a04484415fdb2e4522a197304d8773bde',1,'cv::optflow::GPCTrainingParams::check()'],['https://docs.opencv.org/4.2.0/d1/de5/structcv_1_1cudev_1_1IsBinaryFunction.html#a3be864a9c497fc8a58cac5aa8e5465eb',1,'cv::cudev::IsBinaryFunction::check(binary_function< T1, T2, D >)'],['https://docs.opencv.org/4.2.0/d1/de5/structcv_1_1cudev_1_1IsBinaryFunction.html#a0e4fd65fceffabea4e8d1f6148d9a681',1,'cv::cudev::IsBinaryFunction::check(...)'],['https://docs.opencv.org/4.2.0/d6/d82/structcv_1_1cudev_1_1IsUnaryFunction.html#a22f375dd1a1dca82324c69fc60861447',1,'cv::cudev::IsUnaryFunction::check(unary_function< T, D >)'],['https://docs.opencv.org/4.2.0/d6/d82/structcv_1_1cudev_1_1IsUnaryFunction.html#a6941577791fd0617b7a50bfe7cf4b7b2',1,'cv::cudev::IsUnaryFunction::check(...)']]], + ['check_20pnsr_20and_20ssim_20on_20the_20gpu_654',['Similarity check (PNSR and SSIM) on the GPU',['https://docs.opencv.org/4.2.0/dd/d3d/tutorial_gpu_basics_similarity.html',1,'']]], + ['check_2ehpp_655',['check.hpp',['https://docs.opencv.org/4.2.0/d1/d26/check_8hpp.html',1,'']]], + ['checkchessboard_656',['checkChessboard',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gacd8162cfd39138d0bc29e4b53d080673',1,'cv::checkChessboard()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gacd8162cfd39138d0bc29e4b53d080673',1,'checkChessboard()(Global Namespace)']]], + ['checkcudaerror_657',['checkCudaError',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga234cf847a51d5ca5ed42cc68a2ab64d9',1,'cv::cudev::checkCudaError()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga234cf847a51d5ca5ed42cc68a2ab64d9',1,'checkCudaError()(Global Namespace)']]], + ['checkdetectorsize_658',['checkDetectorSize',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a5c6715965fab466de041ad2a39765478',1,'cv::HOGDescriptor']]], + ['checkers_2eh_659',['checkers.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00884.html',1,'']]], + ['checkhardwaresupport_660',['checkHardwareSupport',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga83400136ccc28490087722ef5b3a27d9',1,'cv::checkHardwareSupport()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga83400136ccc28490087722ef5b3a27d9',1,'checkHardwareSupport()(Global Namespace)']]], + ['checkmasks_661',['checkMasks',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#acbcaa368465fd3924c8bb70851a98944',1,'cv::DescriptorMatcher']]], + ['checkoptimalvectorwidth_662',['checkOptimalVectorWidth',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga293c0b13a39f10465e3ea67a018d6779',1,'cv::ocl::checkOptimalVectorWidth()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga293c0b13a39f10465e3ea67a018d6779',1,'checkOptimalVectorWidth()(Global Namespace)']]], + ['checkparams_663',['checkParams',['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a1dbd0738ac18917c29a226d893c1cf67',1,'cv::rgbd::FastICPOdometry::checkParams()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#aefeb1e17c0907f3a56f269559df1debf',1,'cv::rgbd::ICPOdometry::checkParams()'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#ac4fbc5da04bddaead526fd3470b5019b',1,'cv::rgbd::Odometry::checkParams()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a06f66c25c30dfa6ec51ec945f880eec9',1,'cv::rgbd::RgbdICPOdometry::checkParams()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a94c15a2233290ea8b6c5300ca0f39427',1,'cv::rgbd::RgbdOdometry::checkParams()']]], + ['checkrange_664',['checkRange',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga2bd19d89cae59361416736f87e3c7a64',1,'cv::checkRange()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga2bd19d89cae59361416736f87e3c7a64',1,'checkRange()(Global Namespace)']]], + ['checksubdiv_665',['checkSubdiv',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a2be088a8a411fc4dd232f18f7f88e736',1,'cv::Subdiv2D']]], + ['checkvector_666',['checkVector',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a167a8e0a3a3d86e84b70e33483af4466',1,'cv::Mat::checkVector()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a3d9972bea2e00ae4a8e2402dfdd5d99a',1,'cv::UMat::checkVector()']]], + ['cherry_667',['cherry',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#ac0fb905ab35ef2f14aa4dd65c1c10109',1,'cv::viz::Color']]], + ['chessboard_668',['Camera calibration with square chessboard',['https://docs.opencv.org/4.2.0/dc/d43/tutorial_camera_calibration_square_chess.html',1,'']]], + ['chessboardcorners_669',['chessboardCorners',['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html#a208edcbb778d3095cd5543660f6c4482',1,'cv::aruco::CharucoBoard']]], + ['chi2_670',['CHI2',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56a66a909b8add6114fde309d24483bcf82',1,'cv::ml::SVM']]], + ['chi_5fsquared_5fdistribution_671',['chi_squared_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html',1,'std']]], + ['chihistogramcostextractor_672',['ChiHistogramCostExtractor',['https://docs.opencv.org/4.2.0/dd/d43/classcv_1_1ChiHistogramCostExtractor.html',1,'cv']]], + ['child_673',['child',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a16d9f678b0d1822926c28f8db914b8cb',1,'cv::text::ERStat']]], + ['cholesky_674',['Cholesky',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gab39ce257149bdae7f9552e05c05c7642',1,'cv::Cholesky(float *A, size_t astep, int m, float *b, size_t bstep, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gac8d860b8a49bf2ed304b1c82acb916e5',1,'cv::Cholesky(double *A, size_t astep, int m, double *b, size_t bstep, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gab39ce257149bdae7f9552e05c05c7642',1,'Cholesky(float *A, size_t astep, int m, float *b, size_t bstep, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gac8d860b8a49bf2ed304b1c82acb916e5',1,'Cholesky(double *A, size_t astep, int m, double *b, size_t bstep, int n)(Global Namespace)']]], + ['cholesky_20matrix_20decomposition_675',['Cholesky matrix decomposition',['https://docs.opencv.org/4.2.0/d8/d0e/group__core__hal__interface__decomp__cholesky.html',1,'']]], + ['cholesky_20module_676',['Cholesky module',['https://eigen.tuxfamily.org/dox/group__Cholesky__Module.html',1,'']]], + ['cholesky32f_677',['Cholesky32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga511583d8e86bf1156a380207bae1708e',1,'cv::hal::Cholesky32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga511583d8e86bf1156a380207bae1708e',1,'Cholesky32f()(Global Namespace)']]], + ['cholesky64f_678',['Cholesky64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaeace96de6b7ecfa535b9e13a14a20bcb',1,'cv::hal::Cholesky64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaeace96de6b7ecfa535b9e13a14a20bcb',1,'Cholesky64f()(Global Namespace)']]], + ['cholmod_679',['cholmod',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a6a85bf52d6aa480240a64f277d7f96c6',1,'Eigen::CholmodBase::cholmod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a6a85bf52d6aa480240a64f277d7f96c6',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::cholmod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a6a85bf52d6aa480240a64f277d7f96c6',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::cholmod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a6a85bf52d6aa480240a64f277d7f96c6',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::cholmod()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#a6a85bf52d6aa480240a64f277d7f96c6',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::cholmod()']]], + ['cholmodbase_680',['CholmodBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html',1,'Eigen']]], + ['cholmodbase_3c_20_5fmatrixtype_2c_20lower_2c_20cholmoddecomposition_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_681',['CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html',1,'']]], + ['cholmodbase_3c_20_5fmatrixtype_2c_20lower_2c_20cholmodsimplicialldlt_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_682',['CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html',1,'']]], + ['cholmodbase_3c_20_5fmatrixtype_2c_20lower_2c_20cholmodsimplicialllt_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_683',['CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html',1,'']]], + ['cholmodbase_3c_20_5fmatrixtype_2c_20lower_2c_20cholmodsupernodalllt_3c_20_5fmatrixtype_2c_20lower_20_3e_20_3e_684',['CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html',1,'']]], + ['cholmodcommon_685',['cholmodCommon',['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a64761b06dec908b81506c0c2619cd290',1,'Eigen::SPQR']]], + ['cholmoddecomposition_686',['CholmodDecomposition',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodDecomposition.html',1,'Eigen']]], + ['cholmodsimplicialldlt_687',['CholmodSimplicialLDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodSimplicialLDLT.html',1,'Eigen']]], + ['cholmodsimplicialllt_688',['CholmodSimplicialLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodSimplicialLLT.html',1,'Eigen']]], + ['cholmodsupernodalllt_689',['CholmodSupernodalLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodSupernodalLLT.html',1,'Eigen']]], + ['cholmodsupport_20module_690',['CholmodSupport module',['https://eigen.tuxfamily.org/dox/group__CholmodSupport__Module.html',1,'']]], + ['chromaformat_691',['ChromaFormat',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga1887af7daca9ccca0f51f90bc8777280',1,'cv::cudacodec::ChromaFormat'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga1887af7daca9ccca0f51f90bc8777280',1,'ChromaFormat(Global Namespace)']]], ['chromaformat_692',['chromaFormat',['https://docs.opencv.org/4.2.0/d8/db6/structcv_1_1cudacodec_1_1FormatInfo.html#a21878790229154308fd007ee0c5363cf',1,'cv::cudacodec::FormatInfo']]], - ['chromaformat_693',['ChromaFormat',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga1887af7daca9ccca0f51f90bc8777280',1,'cv::cudacodec::ChromaFormat'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga1887af7daca9ccca0f51f90bc8777280',1,'ChromaFormat(Global Namespace)']]], - ['chrono_694',['chrono',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00050.html',1,'']]], - ['cin_695',['cin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afdcd7ecbf1544ef3f79b89f0dd06c3b7',1,'std::cin'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afdcd7ecbf1544ef3f79b89f0dd06c3b7',1,'std::cin']]], - ['cinttypes_696',['cinttypes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00203.html',1,'']]], - ['circle_697',['Circle',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html',1,'cv::gapi::wip::draw::Circle'],['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#af2c26d99260ff2fe878cd6cfe620c0ce',1,'cv::gapi::wip::draw::Circle::Circle()']]], - ['circle_698',['circle',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a6f0d8b2d9e3e947b2a5c1eff9e81ee95',1,'cv::datasets::circle'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a6f0d8b2d9e3e947b2a5c1eff9e81ee95',1,'circle(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaf10604b069374903dbd0f0488cb43670',1,'cv::circle()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaf10604b069374903dbd0f0488cb43670',1,'circle(InputOutputArray img, Point center, int radius, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)']]], - ['circle_20transform_699',['Circle Transform',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_hough_circle.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/da/d53/tutorial_py_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d3/de5/tutorial_js_houghcircles.html',1,'Hough Circle Transform']]], - ['circles_20for_20contours_700',['Creating Bounding boxes and circles for contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'']]], - ['circlesgridfinderparameters_701',['CirclesGridFinderParameters',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html',1,'cv::CirclesGridFinderParameters'],['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#aa39cf0f1e03b45986072a05c8833836b',1,'cv::CirclesGridFinderParameters::CirclesGridFinderParameters()']]], - ['circlesgridfinderparameters2_702',['CirclesGridFinderParameters2',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga3f5d9f231e61d6e3190042fbe510c06c',1,'cv::CirclesGridFinderParameters2'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga3f5d9f231e61d6e3190042fbe510c06c',1,'CirclesGridFinderParameters2(Global Namespace)']]], - ['ciso646_703',['ciso646',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00206.html',1,'']]], - ['cl_20va_20interoperability_704',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], - ['clahe_705',['CLAHE',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1CLAHE.html',1,'cv::CLAHE'],['https://docs.opencv.org/4.2.0/db/d79/classcv_1_1cuda_1_1CLAHE.html',1,'cv::cuda::CLAHE']]], - ['claheclip_706',['claheClip',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#af5391b0a3989222e5ceffbdedbe0203c',1,'cv::optflow::OpticalFlowPCAFlow']]], - ['clamp_707',['clamp',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a683b454f1571780e8ddfc5d781949b51',1,'Eigen::AlignedBox::clamp()'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a96cbdbff03044a3fa5ce79d110863583',1,'cv::dnn::clamp(int ax, int dims)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a98715b4d79f58f3e24cdad247e9c8500',1,'cv::dnn::clamp(int ax, const MatShape &shape)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a62da460ae3a725e9e3aeca87f49168fd',1,'cv::dnn::clamp(const Range &r, int axisSize)']]], - ['clang_20format_20tt_708',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], - ['class_709',['class',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'High level stitching API (Stitcher class)'],['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'Interfacing with raw buffers: the Map class'],['https://eigen.tuxfamily.org/dox/group__TutorialMatrixClass.html',1,'The Matrix class']]], - ['class_20and_20coefficient_20wise_20operations_710',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], - ['class_20hierarchy_711',['The class hierarchy',['https://eigen.tuxfamily.org/dox/TopicClassHierarchy.html',1,'']]], - ['class_5fid_712',['class_id',['https://docs.opencv.org/4.2.0/d9/daa/structcvhalKeyPoint.html#aa61f9f75faea620531ecd6935b5c0edd',1,'cvhalKeyPoint::class_id'],['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a4a82cb1083a3e18d54b055a692b60eee',1,'cv::line_descriptor::KeyLine::class_id'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#aea339bc868102430087b659cd0709c11',1,'cv::KeyPoint::class_id'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a9b8335ac92b58248eecd9d3069e4cd22',1,'cv::linemod::Match::class_id']]], - ['class_5fidx_713',['class_idx',['https://docs.opencv.org/4.2.0/d4/d36/structcv_1_1dnn__objdetect_1_1object.html#ae84c369c19f07f6a58d81bebc74d8943',1,'cv::dnn_objdetect::object']]], - ['class_5fprob_714',['class_prob',['https://docs.opencv.org/4.2.0/d4/d36/structcv_1_1dnn__objdetect_1_1object.html#a36a09a37f76dd520b7ec9d9a2d53406d',1,'cv::dnn_objdetect::object']]], - ['class_5ftemplates_715',['class_templates',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#af9e4e10678d4d451ae66cae2f1b644bb',1,'cv::linemod::Detector']]], - ['classes_716',['Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01506.html',1,'Arithmetic Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01501.html',1,'Base and Implementation Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01497.html',1,'Base and Implementation Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01531.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01535.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01529.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01517.html',1,'Binder Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01508.html',1,'Boolean Operations Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01507.html',1,'Comparison Classes']]], - ['classes_717',['Extending MatrixBase (and other classes)',['https://eigen.tuxfamily.org/dox/TopicCustomizing_Plugins.html',1,'']]], - ['classes_718',['G-API Main Classes',['https://docs.opencv.org/4.2.0/d8/dd0/group__gapi__main__classes.html',1,'']]], - ['classic_719',['classic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#aa50e351ed674a068ff3e179c5a75c21b',1,'std::locale']]], - ['classic_5ftable_720',['classic_table',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a747e7392c1a15e23869442fea9685aaf',1,'std::ctype< char >::classic_table()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a747e7392c1a15e23869442fea9685aaf',1,'std::ctype_byname< char >::classic_table()']]], - ['classid_721',['classID',['https://docs.opencv.org/4.2.0/d7/de4/structcv_1_1dpm_1_1DPMDetector_1_1ObjectDetection.html#ac84bee5fd3b49246aa9f94513970bf66',1,'cv::dpm::DPMDetector::ObjectDetection']]], - ['classids_722',['classIds',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a013280cc0d3d51df042ab12c5ab868d1',1,'cv::linemod::Detector']]], - ['classidx_723',['classIdx',['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#a267757421f3e930023b525c03018fcf0',1,'cv::ml::DTrees::Node']]], - ['classification_20and_20pose_20estimation_724',['CNN for 3D Object Classification and Pose Estimation',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'']]], - ['classificationmodel_725',['ClassificationModel',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1dnn_1_1ClassificationModel.html',1,'cv::dnn::ClassificationModel'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1dnn_1_1ClassificationModel.html#a60f36f932b42af8af345c59aef897e5f',1,'cv::dnn::ClassificationModel::ClassificationModel(const String &model, const String &config="")'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1dnn_1_1ClassificationModel.html#a05807a9b2c9dafcb39ce1f11f0e057e7',1,'cv::dnn::ClassificationModel::ClassificationModel(const Net &network)']]], - ['classifier_726',['Cascade Classifier',['https://docs.opencv.org/4.2.0/db/d28/tutorial_cascade_classifier.html',1,'']]], - ['classifier_727',['classifier',['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a295c34db17493346647f9e5239ada069',1,'cv::text::OCRBeamSearchDecoder::classifier'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#aafcd89c1ec5b53fad60c73a3648ea025',1,'cv::text::OCRHMMDecoder::classifier']]], - ['classifier_20training_728',['Cascade Classifier Training',['https://docs.opencv.org/4.2.0/dc/d88/tutorial_traincascade.html',1,'']]], - ['classifier_5ftype_729',['classifier_type',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga688d3bbaf5a5ac19ffe9633d7dc0156a',1,'cv::text::classifier_type'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga688d3bbaf5a5ac19ffe9633d7dc0156a',1,'classifier_type(Global Namespace)']]], - ['classifiercallback_730',['ClassifierCallback',['https://docs.opencv.org/4.2.0/de/d2d/classcv_1_1text_1_1OCRBeamSearchDecoder_1_1ClassifierCallback.html',1,'cv::text::OCRBeamSearchDecoder::ClassifierCallback'],['https://docs.opencv.org/4.2.0/db/dc0/classcv_1_1text_1_1OCRHMMDecoder_1_1ClassifierCallback.html',1,'cv::text::OCRHMMDecoder::ClassifierCallback']]], - ['classifiersize_731',['ClassifierSize',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#aba7ecad61d7632f75f2b48e7becb1bc1',1,'HaarClassifierCascadeDescriptor']]], - ['classifierthreshold_732',['ClassifierThreshold',['https://docs.opencv.org/4.2.0/d7/dd9/classcv_1_1ClassifierThreshold.html',1,'cv::ClassifierThreshold'],['https://docs.opencv.org/4.2.0/d7/dd9/classcv_1_1ClassifierThreshold.html#aee4340ecf2a8ec66d363aa01af22ebbd',1,'cv::ClassifierThreshold::ClassifierThreshold()']]], - ['classify_733',['classify',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1dnn_1_1ClassificationModel.html#a57ce23e5667c524ec19e07eaead4492f',1,'cv::dnn::ClassificationModel::classify(InputArray frame)'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1dnn_1_1ClassificationModel.html#a1105095e3e262baea6fab4349387cc9a',1,'cv::dnn::ClassificationModel::classify(InputArray frame, int &classId, float &conf)'],['https://docs.opencv.org/4.2.0/dc/d72/classcv_1_1ClfMilBoost.html#a343f692f0989840609b5858da3f0c28c',1,'cv::ClfMilBoost::classify()'],['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a988c984eb44287fff8cb26369facf6c5',1,'cv::ClfOnlineStump::classify()']]], - ['classify_734',['Classify',['https://docs.opencv.org/4.2.0/df/d38/tutorial_feature_classification.html',1,'']]], - ['classify_2emarkdown_735',['classify.markdown',['https://docs.opencv.org/4.2.0/d4/d6a/classify_8markdown.html',1,'']]], - ['classifyf_736',['classifyF',['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a14c56276f7c61d7674cd0125d0001b32',1,'cv::ClfOnlineStump']]], - ['classifysetf_737',['classifySetF',['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#ae4943ccbe6721410bab8efdc4eb63a17',1,'cv::ClfOnlineStump']]], - ['classifysmooth_738',['classifySmooth',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1Detector.html#a540b76d89d3c11c40961cf3f1178414d',1,'cv::Detector::classifySmooth()'],['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html#a355a6ae432a36547df9a62aa38937d84',1,'cv::StrongClassifierDirectSelection::classifySmooth()']]], - ['classname_739',['className',['https://docs.opencv.org/4.2.0/d9/dcd/classcv_1_1saliency_1_1Saliency.html#a63005f710830d5c331d680dc916c507a',1,'cv::saliency::Saliency::className'],['https://docs.opencv.org/4.2.0/d7/da2/classcv_1_1TrackerFeature.html#afdf155c9344c41facfa9b717e123db57',1,'cv::TrackerFeature::className'],['https://docs.opencv.org/4.2.0/dc/d75/classcv_1_1TrackerSamplerAlgorithm.html#a9778464a7b006d7e3b60e891e7d7905f',1,'cv::TrackerSamplerAlgorithm::className'],['https://docs.opencv.org/4.2.0/d2/db9/classcv_1_1TrackerStateEstimator.html#aa212b274bb6c3bf638979b6788f6071c',1,'cv::TrackerStateEstimator::className']]], - ['cleanup_740',['cleanup',['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#a02c27b7fb89eed095708c588af79ff1f',1,'cv::TLSData::cleanup()'],['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#a02c27b7fb89eed095708c588af79ff1f',1,'TLSData< cv::instr::NodeDataTls >::cleanup()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a3fe56df89fa57f6e7c9becf6d15a3454',1,'cv::TLSDataAccumulator::cleanup()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a3fe56df89fa57f6e7c9becf6d15a3454',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::cleanup()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#a60db91833dbbbcb7d3406b819de3b272',1,'cv::TLSDataContainer::cleanup()']]], - ['cleanupdetacheddata_741',['cleanupDetachedData',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a80211de7cf66b22d5408cbe873f7ffe2',1,'cv::TLSDataAccumulator::cleanupDetachedData()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a80211de7cf66b22d5408cbe873f7ffe2',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::cleanupDetachedData()']]], - ['clear_742',['clear',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a4efa6037afcc3e6c51451db17b5e76cf',1,'cv::_OutputArray::clear()'],['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#aec9c965448e4dc851d7cacd3abd84cd1',1,'cv::Algorithm::clear()'],['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html#a6ce738fed1ec74e2c73c698aac632d96',1,'cv::line_descriptor::BinaryDescriptorMatcher::clear()'],['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#a54968befe8957d2691fc8e492aeea72c',1,'cv::BOWTrainer::clear()'],['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a696d5029646669ce9b8bc2c98dc7706f',1,'cv::DescriptorMatcher::DescriptorCollection::clear()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a01f97324f1393aae68d9c84874060454',1,'cv::DescriptorMatcher::clear()'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a1450110e5dd90c1f50e94232bbacb408',1,'cv::cuda::DescriptorMatcher::clear()'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a321910c88a7d8a887843ce2173f58a6e',1,'cv::FlannBasedMatcher::clear()'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#af5b0241d5aed2b281fa06ee44035db7c',1,'cv::SparseMat::Hdr::clear()'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#a5b9526bed58f7dd32807de1fa4bffacd',1,'NCVMatrix::clear()'],['https://docs.opencv.org/4.2.0/d6/d86/structNCVMemPtr.html#a6756da2769710936ae259a9ae8164584',1,'NCVMemPtr::clear()'],['https://docs.opencv.org/4.2.0/d2/d12/structNCVMemSegment.html#a70429f73536c036be44899623cb74b54',1,'NCVMemSegment::clear()'],['https://docs.opencv.org/4.2.0/dc/d73/classNCVVector.html#a6e4266667afe348817d08a7363330462',1,'NCVVector::clear()'],['https://docs.opencv.org/4.2.0/da/d83/classcv_1_1quality_1_1QualityBase.html#a6b1ecba1e463610e584e67222d59064f',1,'cv::quality::QualityBase::clear()'],['https://docs.opencv.org/4.2.0/d8/d81/classcv_1_1quality_1_1QualityGMSD.html#adb3c0ad4b55d524f3ec3cb499756a0fc',1,'cv::quality::QualityGMSD::clear()'],['https://docs.opencv.org/4.2.0/d7/d80/classcv_1_1quality_1_1QualityMSE.html#a64ca28049724f66c76f1cd309d65722e',1,'cv::quality::QualityMSE::clear()'],['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#adcac059e137150e7627f87c971a00d41',1,'cv::quality::QualityPSNR::clear()'],['https://docs.opencv.org/4.2.0/d9/db5/classcv_1_1quality_1_1QualitySSIM.html#ac527e54b09d8f8375be2403426724709',1,'cv::quality::QualitySSIM::clear()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a2fa705d84961513f6e0b0066ec245a8e',1,'cv::SparseMat::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab778e468351ba1d0365bccda523e1eba',1,'__gnu_cxx::__versa_string::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'basic_ios< char, _Traits >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'basic_iostream< char >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'basic_istream< char >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'basic_istream< char, _Traits >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'basic_ostream< char >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'basic_ostream< char, _Traits >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< _CharT >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< _CharT, _Traits, _Allocator >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< char >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< char, char_traits< char >, _Byte_alloc >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< char_type, _Traits, _Alloc >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< value_type >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a1a753bfa9e6b675bac7ee9ec4365fbdf',1,'deque< _StateSeqT >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ae36feac84d9e8125b700ce5189ed9e95',1,'list< __inp, __rebind_inp >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'match_results< _Bi_iter >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_fstream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_ifstream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_ios::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_iostream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_istream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_istringstream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_ofstream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_ostream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_ostringstream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'std::basic_string::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_stringstream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a1a753bfa9e6b675bac7ee9ec4365fbdf',1,'std::deque::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a5beaf2ef0d35c15246261ecce68809b0',1,'std::experimental::fundamentals_v1::any::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aa88c1d40b71b3724ca63da3b66d4a5e0',1,'std::forward_list::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ae36feac84d9e8125b700ce5189ed9e95',1,'std::list::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a5c72b2772d31bff52f9454a583547f58',1,'std::map::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'std::match_results::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a31487eed37318f2466fdf59e0d150e81',1,'std::multimap::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ace71f2e5ccf1cf04f7684fe40490f9d6',1,'std::multiset::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ad06b71a81f86eca8862b0cbc0572622c',1,'std::set::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae9ed6af5f774f6eb904fe29b21a0c013',1,'std::tr2::dynamic_bitset::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a9728c777ec0429619531a26201560c18',1,'std::unordered_map::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a96159c845937ab5729b5ed41a7ef6071',1,'std::unordered_multimap::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a18e69290f6407ee6a2de58b005f4309e',1,'std::unordered_multiset::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ad8049c5e823b2e158de097c48b4bcb0d',1,'std::unordered_set::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'std::vector::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a9728c777ec0429619531a26201560c18',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< __diff_type >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _CharClassT >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _CharT >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _Cmpt >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _Node *, _Nodeptr_Alloc >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _RealType >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _State< _TraitsT::char_type > >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _StringT >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< block_type, allocator_type >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< Catalog_info * >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< double >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< int >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< result_type >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< size_t >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< std::pair< _BiIter, int > >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< std::pair< _StateIdT, std::vector > >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< std::pair< _StrTransT, _StrTransT > >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< sub_match< _Bi_iter >, _Alloc >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< sub_match< _BiIter >, _Alloc >::clear()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a946cc8f30d8b1d6609b57387b647fe53.html#a946cc8f30d8b1d6609b57387b647fe53',1,'nlohmann::basic_json::clear()'],['../classutil_1_1PeriodicScheduler.html#ac657af10208f7e1c9b31abc17988b316',1,'util::PeriodicScheduler::clear()']]], - ['clear_5fsubtype_743',['clear_subtype',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a7b122b28ff2b8680557ca44ac9748e49.html#a7b122b28ff2b8680557ca44ac9748e49',1,'nlohmann::byte_container_with_subtype']]], - ['clearallbuffers_744',['clearAllBuffers',['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#afc20fcba4a50aedc2f4d8919588bb911',1,'cv::bioinspired::TransientAreasSegmentationModule']]], - ['clearbuffers_745',['clearBuffers',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a09603d1ed6c8f82459526bbe2ac4eac6',1,'cv::bioinspired::Retina']]], - ['cleargraphsegmentations_746',['clearGraphSegmentations',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a301547b9a40db0da72aeb713f15de5b5',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], - ['clearimages_747',['clearImages',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a278455e3f341f14d755305b3bb80317a',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], - ['clearstat_748',['ClearStat',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a600bc14c62384d9e0fd6ba86887c0faa',1,'cv::cudacodec::EncoderParams']]], - ['clearstrategies_749',['clearStrategies',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a63b7cae2e58f2a47bb533928f998b6e2',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation::clearStrategies()'],['https://docs.opencv.org/4.2.0/d8/d8e/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategyMultiple.html#ae9e541d9caabdebc4810c65164e736a4',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentationStrategyMultiple::clearStrategies()']]], - ['cleartrainingmodels_750',['clearTrainingModels',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a3fbd9d01c645212a35dc885ca3100fc7',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['clearvoronoi_751',['clearVoronoi',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#ae3a27a930a710466051547b80dd64ef1',1,'cv::Subdiv2D']]], - ['clfmilboost_752',['ClfMilBoost',['https://docs.opencv.org/4.2.0/dc/d72/classcv_1_1ClfMilBoost.html',1,'cv::ClfMilBoost'],['https://docs.opencv.org/4.2.0/dc/d72/classcv_1_1ClfMilBoost.html#aeb293336072f7eda8f1cc8bd6678aa7b',1,'cv::ClfMilBoost::ClfMilBoost()']]], - ['clfonlinestump_753',['ClfOnlineStump',['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html',1,'cv::ClfOnlineStump'],['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a0dae599812f552049b9247f1ecb3171f',1,'cv::ClfOnlineStump::ClfOnlineStump()'],['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a1d574dc40c0f453aeb60162f3ad396bd',1,'cv::ClfOnlineStump::ClfOnlineStump(int ind)']]], - ['climits_754',['climits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00209.html',1,'']]], - ['clipline_755',['clipLine',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaf483cb46ad6b049bc35ec67052ef1c2c',1,'cv::clipLine(Size imgSize, Point &pt1, Point &pt2)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gab156b52ae9174369cb035f1e9dfb29e1',1,'cv::clipLine(Size2l imgSize, Point2l &pt1, Point2l &pt2)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga36117422ae2f891c7b03023261e25928',1,'cv::clipLine(Rect imgRect, Point &pt1, Point &pt2)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaf483cb46ad6b049bc35ec67052ef1c2c',1,'clipLine(Size imgSize, Point &pt1, Point &pt2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gab156b52ae9174369cb035f1e9dfb29e1',1,'clipLine(Size2l imgSize, Point2l &pt1, Point2l &pt2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga36117422ae2f891c7b03023261e25928',1,'clipLine(Rect imgRect, Point &pt1, Point &pt2)(Global Namespace)']]], - ['clocale_756',['clocale',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00212.html',1,'']]], - ['clockrate_757',['clockRate',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8529cf2de8f281ce95d9350da1b2e210',1,'cv::cuda::DeviceInfo']]], - ['clog_758',['clog',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7e2a2fc4b5924b7292c0566ca4c95463',1,'std::clog'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7e2a2fc4b5924b7292c0566ca4c95463',1,'std::clog']]], - ['clojure_759',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], - ['clojure_5fdev_5fintro_2emarkdown_760',['clojure_dev_intro.markdown',['https://docs.opencv.org/4.2.0/da/d37/clojure__dev__intro_8markdown.html',1,'']]], - ['clone_761',['clone',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#a117b4667faf1974e5a3f0b8d7ba1c0a1',1,'cv::BFMatcher::clone()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#aa0c8b81f03de2d386bce302ccd9bd431',1,'cv::ogl::Buffer::clone()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a8d0dfab3c560c3edada03155c97ed8a9',1,'cv::DescriptorMatcher::clone()'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#aa181710f75e8be9539939247b645557b',1,'cv::FlannBasedMatcher::clone()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ae1d42819f7f3251478cd6edab8069758',1,'cv::cuda::GpuMat::clone()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a3a157968855ce36fd7045b57eaae6639',1,'cv::cudev::GpuMat_::clone()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a29b76f344d85d77b4c51478cfebbbd28',1,'cv::cuda::HostMem::clone()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#adff2ea98da45eae0833e73582dd4a660',1,'cv::Mat::clone()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac1e023d30dbb85d9e6773f01dc521f24',1,'cv::Mat_::clone()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac1e023d30dbb85d9e6773f01dc521f24',1,'Mat_< double >::clone()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac1e023d30dbb85d9e6773f01dc521f24',1,'Mat_< float >::clone()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac1e023d30dbb85d9e6773f01dc521f24',1,'Mat_< uchar >::clone()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac1e023d30dbb85d9e6773f01dc521f24',1,'Mat_< unsigned char >::clone()'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a0502d5c729cf16937f1ad2fbf7baed65',1,'cv::ppf_match_3d::Pose3D::clone()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a230a36b59925a5e300a703ae1186856b',1,'cv::SparseMat::clone()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#abf80a5f4b7c7d33c97b9189d5587613e',1,'cv::SparseMat_::clone()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aac63c68170021973b171e94746c253ac',1,'cv::UMat::clone()']]], - ['clone_5fop_762',['clone_op',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a7aa961c11ccdc6a9b1495f5aaf83d251',1,'cv::DescriptorMatcher']]], - ['cloning_763',['Seamless Cloning',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html',1,'']]], - ['close_764',['close',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a559351f76c3c3d69a7560ac67a72687c',1,'cv::AVIReadContainer::close()'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#aa56606dd84312a4c1010f0e6e918fd9b',1,'cv::hdf::HDF5::close()'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a600d62f9dd17f1bfb71e7331b021ec6d',1,'cv::viz::Viz3d::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a5e13a128abb0a5dd8ef1e3d10597031f',1,'__gnu_cxx::enc_filebuf::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a5e13a128abb0a5dd8ef1e3d10597031f',1,'__gnu_cxx::stdio_filebuf::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a5e13a128abb0a5dd8ef1e3d10597031f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a5e13a128abb0a5dd8ef1e3d10597031f',1,'basic_filebuf< char_type, traits_type >::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a5e13a128abb0a5dd8ef1e3d10597031f',1,'std::basic_filebuf::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02079.html#adf2ca5f243067d406a96f91763173839',1,'std::basic_fstream::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02071.html#adca6a6b93f9f3ae1c9393213caa37a9a',1,'std::basic_ifstream::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02075.html#a63e51ce67bbd3eee66b04851100a8a52',1,'std::basic_ofstream::close()']]], - ['close_5fcamera_765',['CLOSE_CAMERA',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html#gga5291115322efc2f86c7551ab37ab6554a5a4ff95ee598bda6d396d9c2170b2583',1,'cv::CLOSE_CAMERA'],['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html#gga5291115322efc2f86c7551ab37ab6554a5a4ff95ee598bda6d396d9c2170b2583',1,'CLOSE_CAMERA(Global Namespace)']]], - ['closestheading_766',['closestHeading',['../namespaceutil.html#aa10a4493a1c38a1868ea8af92bac1503',1,'util']]], - ['closestream_767',['closeStream',['../classnet_1_1mc_1_1tasks_1_1CameraStreamTask.html#a718c1930e0f994cec8d7d6363b4a3690',1,'net::mc::tasks::CameraStreamTask']]], - ['cloud_768',['cloud',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a2719f6673412252b5539191b5d8db580',1,'cv::viz::Mesh']]], - ['cls_769',['cls',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a4edc0824e04404495ae77fb97cf2fdc1',1,'cv::CvFeatureEvaluator']]], - ['cluster_770',['cluster',['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#a489bdcbdbc8f1d470683e3c375b1a4df',1,'cv::BOWKMeansTrainer::cluster() const CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#a0ac921f4781724dbd4b2ce06e34c304f',1,'cv::BOWKMeansTrainer::cluster(const Mat &descriptors) const CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#abbd3b3cb63690fa7128db1a1fcb84eab',1,'cv::BOWTrainer::cluster() const=0'],['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#ab869df2d888741c37e33c06eee8d54dc',1,'cv::BOWTrainer::cluster(const Mat &descriptors) const=0']]], - ['clustercount_771',['clusterCount',['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#aec28a6dd06354f4b13462434e1f39e03',1,'cv::BOWKMeansTrainer']]], - ['clustering_772',['Clustering',['https://docs.opencv.org/4.2.0/d5/d38/group__core__cluster.html',1,'Clustering'],['https://docs.opencv.org/4.2.0/d9/d70/tutorial_py_kmeans_index.html',1,'K-Means Clustering'],['https://docs.opencv.org/4.2.0/de/d4d/tutorial_py_kmeans_understanding.html',1,'Understanding K-Means Clustering']]], - ['clustering_20and_20search_20in_20multi_20dimensional_20spaces_773',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], - ['clustering_20in_20opencv_774',['K-Means Clustering in OpenCV',['https://docs.opencv.org/4.2.0/d1/d5c/tutorial_py_kmeans_opencv.html',1,'']]], - ['cmake_775',['Using OpenCV with gcc and CMake',['https://docs.opencv.org/4.2.0/db/df5/tutorial_linux_gcc_cmake.html',1,'']]], - ['cmake_20projects_776',['Using Eigen in CMake Projects',['https://eigen.tuxfamily.org/dox/TopicCMakeGuide.html',1,'']]], - ['cmake_20version_203_209_201_777',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], - ['cmath_778',['cmath',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00215.html',1,'']]], - ['cmp16s_779',['cmp16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga4cbdcc03d0a35df354db3b9ffc8a05e3',1,'cv::hal::cmp16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga4cbdcc03d0a35df354db3b9ffc8a05e3',1,'cmp16s()(Global Namespace)']]], - ['cmp16u_780',['cmp16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf5331cf7cc620dd06390a7a4ad337240',1,'cv::hal::cmp16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf5331cf7cc620dd06390a7a4ad337240',1,'cmp16u()(Global Namespace)']]], - ['cmp32f_781',['cmp32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga822695283d4dc9f2bf882fea9dccee9f',1,'cv::hal::cmp32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga822695283d4dc9f2bf882fea9dccee9f',1,'cmp32f()(Global Namespace)']]], - ['cmp32s_782',['cmp32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga74d6cc76af8045b57be921340f437d62',1,'cv::hal::cmp32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga74d6cc76af8045b57be921340f437d62',1,'cmp32s()(Global Namespace)']]], - ['cmp64f_783',['cmp64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaab047b38298429955aa9aeb0c2148047',1,'cv::hal::cmp64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaab047b38298429955aa9aeb0c2148047',1,'cmp64f()(Global Namespace)']]], - ['cmp8s_784',['cmp8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga84dd422284915a26720959fe79b7fb04',1,'cv::hal::cmp8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga84dd422284915a26720959fe79b7fb04',1,'cmp8s()(Global Namespace)']]], - ['cmp8u_785',['cmp8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga12c4782d42112f392d07931e02cb6de7',1,'cv::hal::cmp8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga12c4782d42112f392d07931e02cb6de7',1,'cmp8u()(Global Namespace)']]], - ['cmp_5feq_786',['CMP_EQ',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a878fbe5d23e277c3d87128a8844e639d',1,'cv::CMP_EQ'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a878fbe5d23e277c3d87128a8844e639d',1,'CMP_EQ(Global Namespace)']]], - ['cmp_5ffn_787',['cmp_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#acb3bfca7ffae5a572e1a8698bf0c1255',1,'__gnu_pbds::tree']]], - ['cmp_5ffn_5fimps_2ehpp_788',['cmp_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01244.html',1,'']]], - ['cmp_5fge_789',['CMP_GE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a0dd1b1a6fa443343f44aef8c52942625',1,'cv::CMP_GE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a0dd1b1a6fa443343f44aef8c52942625',1,'CMP_GE(Global Namespace)']]], - ['cmp_5fgt_790',['CMP_GT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784ada5167eceeaca5a3dc9d7f6a96255827',1,'cv::CMP_GT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784ada5167eceeaca5a3dc9d7f6a96255827',1,'CMP_GT(Global Namespace)']]], - ['cmp_5fle_791',['CMP_LE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a45cc5be6c7f35292542aa7c00ce4cf1c',1,'cv::CMP_LE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a45cc5be6c7f35292542aa7c00ce4cf1c',1,'CMP_LE(Global Namespace)']]], - ['cmp_5flt_792',['CMP_LT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a5a747de43c04d59b6e51a2959a8af105',1,'cv::CMP_LT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a5a747de43c04d59b6e51a2959a8af105',1,'CMP_LT(Global Namespace)']]], - ['cmp_5fne_793',['CMP_NE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a7997997a104b827c918884b6c5ee0e59',1,'cv::CMP_NE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a7997997a104b827c918884b6c5ee0e59',1,'CMP_NE(Global Namespace)']]], - ['cmpeq_794',['cmpEQ',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaea61a43cc393b6bfa81fc57007df28d2',1,'cv::gapi::cmpEQ(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga947f0104b91a77f40430b226fccdd2f0',1,'cv::gapi::cmpEQ(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaea61a43cc393b6bfa81fc57007df28d2',1,'cmpEQ(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga947f0104b91a77f40430b226fccdd2f0',1,'cmpEQ(const GMat &src1, const GScalar &src2)(Global Namespace)']]], - ['cmpge_795',['cmpGE',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga2b13187939387e99b4a7dbc497d9d52d',1,'cv::gapi::cmpGE(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga6e4dd0a6dd8f9420d2f6635c912fb396',1,'cv::gapi::cmpGE(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga2b13187939387e99b4a7dbc497d9d52d',1,'cmpGE(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga6e4dd0a6dd8f9420d2f6635c912fb396',1,'cmpGE(const GMat &src1, const GScalar &src2)(Global Namespace)']]], - ['cmpgt_796',['cmpGT',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gae7804b39335c3a62d21e7afd1c1fa566',1,'cv::gapi::cmpGT(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga19547e74738ea21e6c97d1149dddb6ef',1,'cv::gapi::cmpGT(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gae7804b39335c3a62d21e7afd1c1fa566',1,'cmpGT(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga19547e74738ea21e6c97d1149dddb6ef',1,'cmpGT(const GMat &src1, const GScalar &src2)(Global Namespace)']]], - ['cmple_797',['cmpLE',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga1a745b957e7f94c416a5773a13524576',1,'cv::gapi::cmpLE(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gab9df2b0aac068354dabb781a7250cdc4',1,'cv::gapi::cmpLE(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga1a745b957e7f94c416a5773a13524576',1,'cmpLE(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gab9df2b0aac068354dabb781a7250cdc4',1,'cmpLE(const GMat &src1, const GScalar &src2)(Global Namespace)']]], - ['cmplt_798',['cmpLT',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaa67732d475ab1df386eebff7b90895da',1,'cv::gapi::cmpLT(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga916e9433be97f99b0d6992ac1d1926de',1,'cv::gapi::cmpLT(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaa67732d475ab1df386eebff7b90895da',1,'cmpLT(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga916e9433be97f99b0d6992ac1d1926de',1,'cmpLT(const GMat &src1, const GScalar &src2)(Global Namespace)']]], - ['cmpne_799',['cmpNE',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga6646d5a6e2ed232281fddd08d2a52772',1,'cv::gapi::cmpNE(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaac184e5ab0dc3b1ee74775c6bdc634e2',1,'cv::gapi::cmpNE(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga6646d5a6e2ed232281fddd08d2a52772',1,'cmpNE(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaac184e5ab0dc3b1ee74775c6bdc634e2',1,'cmpNE(const GMat &src1, const GScalar &src2)(Global Namespace)']]], - ['cmptypes_800',['CmpTypes',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0cc47ff833d40b58ecbe1d609a53d784',1,'cv::CmpTypes'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0cc47ff833d40b58ecbe1d609a53d784',1,'CmpTypes(Global Namespace)']]], - ['cn_801',['CN',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#a2a97c5b832651524b8e782496b933d45abdd27d54b8b8e5d80e392a1a40c18fe1',1,'cv::TrackerKCF']]], - ['cn_802',['cn',['https://docs.opencv.org/4.2.0/dc/df8/structcv_1_1cudev_1_1VecTraits_3_01char1_01_4.html#ae8807eab22e09639bac1c77010891db0a0887f0bf7575fa61bbb8c219e2931398',1,'cv::cudev::VecTraits< char1 >::cn'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1cudev_1_1VecTraits_3_01char2_01_4.html#ab397210ae3a1d3ac2aff16b666b2a614a866c28ba41d9eac9ca97dcde8046c4e1',1,'cv::cudev::VecTraits< char2 >::cn'],['https://docs.opencv.org/4.2.0/df/de4/structcv_1_1cudev_1_1VecTraits_3_01char3_01_4.html#a161a54c33544af83c6f93a4e7bbc736ca810ad6828fcbe6917ab982c45a7791ca',1,'cv::cudev::VecTraits< char3 >::cn'],['https://docs.opencv.org/4.2.0/dc/df6/structcv_1_1cudev_1_1VecTraits_3_01char4_01_4.html#a9d82b4027ca3001951a7650501746c49a0c04ed059b66b7582d5fa19df51787e6',1,'cv::cudev::VecTraits< char4 >::cn'],['https://docs.opencv.org/4.2.0/d1/d4e/structcv_1_1cudev_1_1VecTraits_3_01double_01_4.html#a0cc7f0ea115daf0ba3bc859904b6b71fafb865c68bb78e8e4f31a1f95536f6769',1,'cv::cudev::VecTraits< double >::cn'],['https://docs.opencv.org/4.2.0/d1/de1/structcv_1_1cudev_1_1VecTraits_3_01double1_01_4.html#afa9539490e407da9e35220b354e73defa22986735ee0c252c3858220cd9971851',1,'cv::cudev::VecTraits< double1 >::cn'],['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1VecTraits_3_01double2_01_4.html#a35d37a9e1d2131d515b04380b0be70e9a59f9c1ac43f38a2427db160aa43c67ee',1,'cv::cudev::VecTraits< double2 >::cn'],['https://docs.opencv.org/4.2.0/d5/d24/structcv_1_1cudev_1_1VecTraits_3_01double3_01_4.html#a82086d4574f4a544fd1ed1354281382aa5aea1f06ec7fb53491ac4d503713df77',1,'cv::cudev::VecTraits< double3 >::cn'],['https://docs.opencv.org/4.2.0/d1/d5d/structcv_1_1cudev_1_1VecTraits_3_01double4_01_4.html#a8f5f97e6409e888cef52d38312fc9c7aa91e28159bc11e937807e3c58f35468b0',1,'cv::cudev::VecTraits< double4 >::cn'],['https://docs.opencv.org/4.2.0/d0/d48/structcv_1_1cudev_1_1VecTraits_3_01float_01_4.html#af3a14a81c356ea7a70cb9ec81f6e1948aa095f47aed4b3c57a477ef3ba11f1b5e',1,'cv::cudev::VecTraits< float >::cn'],['https://docs.opencv.org/4.2.0/dc/d22/structcv_1_1cudev_1_1VecTraits_3_01float1_01_4.html#a7655f9ced40cf11548e0fd1e8bf88b31ad0fd865636e8227ffc131bdece00502d',1,'cv::cudev::VecTraits< float1 >::cn'],['https://docs.opencv.org/4.2.0/d9/dfe/structcv_1_1cudev_1_1VecTraits_3_01float2_01_4.html#a2ed991fac6c5cf3544a4085e5d035b5ba0e23b144bea2bd0bb0a1d6b96f4a77f5',1,'cv::cudev::VecTraits< float2 >::cn'],['https://docs.opencv.org/4.2.0/d9/d1a/structcv_1_1cudev_1_1VecTraits_3_01float3_01_4.html#aebe4e0f9b5f588af37c7ad5daa2c571ba27a095590a714ce9d315768c2d4e86e9',1,'cv::cudev::VecTraits< float3 >::cn'],['https://docs.opencv.org/4.2.0/d9/d9c/structcv_1_1cudev_1_1VecTraits_3_01float4_01_4.html#a652718881ac1ee6fa5539f259fa98167aca12f48fdf94fbbd6cda178f7f823a09',1,'cv::cudev::VecTraits< float4 >::cn'],['https://docs.opencv.org/4.2.0/d7/dc2/structcv_1_1cudev_1_1VecTraits_3_01int1_01_4.html#a44c81cb7c73207f347f44baa1f0ec4deaeb6ca6c0b10d300728108ac09f742666',1,'cv::cudev::VecTraits< int1 >::cn'],['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1VecTraits_3_01int2_01_4.html#a13a65546037ee5ed83720fbf005316cbadf3e8a47e667f2e0395b5fc9cc9ef02d',1,'cv::cudev::VecTraits< int2 >::cn'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1VecTraits_3_01int3_01_4.html#aa1d2cc4b6dd8bcd19a9745038bc9404ea0144ac25f8f3eb5c4e4de6093ee892c6',1,'cv::cudev::VecTraits< int3 >::cn'],['https://docs.opencv.org/4.2.0/da/d75/structcv_1_1cudev_1_1VecTraits_3_01int4_01_4.html#a9cb48b9378b44382cea7eaf5aaa7a3bcacdd1f31c8935e718f4748578679382bd',1,'cv::cudev::VecTraits< int4 >::cn'],['https://docs.opencv.org/4.2.0/d4/d43/structcv_1_1cudev_1_1VecTraits_3_01schar_01_4.html#a3731dabc6b26014fff21e0de2c6a0065a0f2717a73449e3809e01f9b0d8a51f31',1,'cv::cudev::VecTraits< schar >::cn'],['https://docs.opencv.org/4.2.0/da/df0/structcv_1_1cudev_1_1VecTraits_3_01short_01_4.html#ac5cf27c7a3b0796552b95d2b69862af7a470b70491c09549908ee51fd788fb515',1,'cv::cudev::VecTraits< short >::cn'],['https://docs.opencv.org/4.2.0/d6/dec/structcv_1_1cudev_1_1VecTraits_3_01short1_01_4.html#ada37eb577efc1a21e21e454e4b330a53a7a61b37c695fe793e436184430f7883c',1,'cv::cudev::VecTraits< short1 >::cn'],['https://docs.opencv.org/4.2.0/dd/d78/structcv_1_1cudev_1_1VecTraits_3_01short2_01_4.html#a8400ebcedc05799a03324705cd1f5ac6afeb13647e349e519b58493a44714780c',1,'cv::cudev::VecTraits< short2 >::cn'],['https://docs.opencv.org/4.2.0/da/d6d/structcv_1_1cudev_1_1VecTraits_3_01short3_01_4.html#a9f522ee86dbc3fc35145b008c484f750a031073946bb24c67a8e78f2bd37a56c5',1,'cv::cudev::VecTraits< short3 >::cn'],['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1VecTraits_3_01short4_01_4.html#a4c229c74d9755e4599f64c10293265e8afe34ac324bc5a5caa2673912453d93c5',1,'cv::cudev::VecTraits< short4 >::cn'],['https://docs.opencv.org/4.2.0/df/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar_01_4.html#a64a5f8c02a63702e2e1d83b43b265088a94301d78e8fa0b6cab848635d2a984ef',1,'cv::cudev::VecTraits< uchar >::cn'],['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar1_01_4.html#aa5034b7de2850b6d6dd28556ba5ba6b2ad8d6a2cfb52b3816ea5ec3777eb8d245',1,'cv::cudev::VecTraits< uchar1 >::cn'],['https://docs.opencv.org/4.2.0/d0/da8/structcv_1_1cudev_1_1VecTraits_3_01uchar2_01_4.html#a93eb29b11470dd42f8f1cc556de33cfcab96c4cf57d01c9bb4cdab43268b932d2',1,'cv::cudev::VecTraits< uchar2 >::cn'],['https://docs.opencv.org/4.2.0/da/d8a/structcv_1_1cudev_1_1VecTraits_3_01uchar3_01_4.html#aab981b0faf5127a0fa4a99d82d8e10f9ad6201eb2813e8de1b9b1c0616f731b25',1,'cv::cudev::VecTraits< uchar3 >::cn'],['https://docs.opencv.org/4.2.0/d4/dc1/structcv_1_1cudev_1_1VecTraits_3_01uchar4_01_4.html#a176d09042450c5513596c0a382aa7683aea90dc6b8d254db8996aa858ea1d0876',1,'cv::cudev::VecTraits< uchar4 >::cn'],['https://docs.opencv.org/4.2.0/de/d87/structcv_1_1cudev_1_1VecTraits_3_01uint_01_4.html#aa8c714090accbd28ff17fac983f2599da4b8df1a1ff6c65a4336b27b0a6a251c7',1,'cv::cudev::VecTraits< uint >::cn'],['https://docs.opencv.org/4.2.0/de/d41/structcv_1_1cudev_1_1VecTraits_3_01uint1_01_4.html#a2bff6b19fef8faf5ec7a8da2abf4d176a6ca4aec6b9dea7ce42752e17110cd801',1,'cv::cudev::VecTraits< uint1 >::cn'],['https://docs.opencv.org/4.2.0/d7/d19/structcv_1_1cudev_1_1VecTraits_3_01uint2_01_4.html#a907682bcd6d2d60d773c4c95ef36de1ba093f1270803a694a481dc581c23c6ff2',1,'cv::cudev::VecTraits< uint2 >::cn'],['https://docs.opencv.org/4.2.0/da/d00/structcv_1_1cudev_1_1VecTraits_3_01uint3_01_4.html#a3478d28c8ff3f145fd3b2c6362b93f65ac044744a2cfee6b05c861777fcda2bd5',1,'cv::cudev::VecTraits< uint3 >::cn'],['https://docs.opencv.org/4.2.0/dc/d7c/structcv_1_1cudev_1_1VecTraits_3_01uint4_01_4.html#a524289c241acd2fab6073ade39930d4aa681edf5831031ffc3a4db4f34c150e26',1,'cv::cudev::VecTraits< uint4 >::cn'],['https://docs.opencv.org/4.2.0/d9/db8/structcv_1_1cudev_1_1VecTraits_3_01ushort_01_4.html#a11daa5946ed173961f2be099de203e09a7d54dde82283ff456c9767ebbeecb530',1,'cv::cudev::VecTraits< ushort >::cn'],['https://docs.opencv.org/4.2.0/da/d76/structcv_1_1cudev_1_1VecTraits_3_01ushort1_01_4.html#a8045ac31178b2d3ee771a91858493140a47f220862dfa62e44fffca1a60e2c28a',1,'cv::cudev::VecTraits< ushort1 >::cn'],['https://docs.opencv.org/4.2.0/d0/d40/structcv_1_1cudev_1_1VecTraits_3_01ushort2_01_4.html#a9772040257ac14a7a62b1bd05ac9065dad67f4094e48fa58f9712e9ef6ffb9b3e',1,'cv::cudev::VecTraits< ushort2 >::cn'],['https://docs.opencv.org/4.2.0/d4/dd7/structcv_1_1cudev_1_1VecTraits_3_01ushort3_01_4.html#ad3382979d7e87b95026f12005017ca07a876e11f1d920b9dcbae74115dffbf5a5',1,'cv::cudev::VecTraits< ushort3 >::cn'],['https://docs.opencv.org/4.2.0/d3/d14/structcv_1_1cudev_1_1VecTraits_3_01ushort4_01_4.html#ad2389b50b0227ab35034175763e33b5ba216d55c9f868f4f21b87de6e64ebc120',1,'cv::cudev::VecTraits< ushort4 >::cn']]], - ['cn_20tracker_803',['Customizing the CN Tracker',['https://docs.opencv.org/4.2.0/dc/db8/tutorial_customizing_cn_tracker.html',1,'']]], - ['cnn_20for_203d_20object_20classification_20and_20pose_20estimation_804',['CNN for 3D Object Classification and Pose Estimation',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'']]], - ['cnn_5f3dobj_2ehpp_805',['cnn_3dobj.hpp',['https://docs.opencv.org/4.2.0/de/d45/cnn__3dobj_8hpp.html',1,'']]], - ['cnns_806',['CNNs',['https://docs.opencv.org/4.2.0/d2/da2/tutorial_dnn_objdetect.html',1,'Object Detection using CNNs'],['https://docs.opencv.org/4.2.0/d8/df8/tutorial_table_of_content_dnn_superres.html',1,'Super Resolution using CNNs']]], - ['coarseparams_807',['coarseParams',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#ae4afa6666e23d21522270c6c78769823',1,'cv::dynafu::Params::coarseParams()'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a8164c3adc75f3d3e548fbf806a0eb329',1,'cv::kinfu::Params::coarseParams()']]], - ['code_808',['code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'Basic concepts of the homography explained with code'],['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a81405b438c930b556e9c71210d799e2b',1,'cv::Exception::code'],['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#a90f5e8b6d152aa7f1ecf4a5098020c74',1,'cv::viz::KeyboardEvent::code'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06867.html#a3fa7937e28854ac53d3e7b51e1cca6a3',1,'std::regex_error::code()']]], - ['code_809',['Code',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abcca',1,'cv::Error']]], - ['code_810',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], - ['code_20pattern_20tutorial_811',['code pattern tutorial',['https://docs.opencv.org/4.2.0/db/d56/tutorial_capture_graycode_pattern.html',1,'Capture Gray code pattern tutorial'],['https://docs.opencv.org/4.2.0/dc/da9/tutorial_decode_graycode_pattern.html',1,'Decode Gray code pattern tutorial']]], - ['codec_812',['codec',['https://docs.opencv.org/4.2.0/d8/db6/structcv_1_1cudacodec_1_1FormatInfo.html#aa43606fe19ccfc8f9bc98a92377fd999',1,'cv::cudacodec::FormatInfo']]], - ['codec_813',['Codec',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga71943a1181287609b5d649f53ce6c146',1,'cv::cudacodec::Codec'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga71943a1181287609b5d649f53ce6c146',1,'Codec(Global Namespace)']]], - ['codecs_814',['Codecs',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a9104e3711964b4e7723bab15987f41b9',1,'cv']]], - ['codecvt_815',['codecvt',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05199.html',1,'std::codecvt< _InternT, _ExternT, _StateT >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00056.html',1,'(Global Namespace)']]], - ['codecvt_2eh_816',['codecvt.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00305.html',1,'']]], - ['codecvt_3c_20_5felem_2c_20char_2c_20mbstate_5ft_20_3e_817',['codecvt< _Elem, char, mbstate_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05199.html',1,'']]], - ['codecvt_3c_20_5finternt_2c_20_5fexternt_2c_20encoding_5fstate_20_3e_818',['codecvt< _InternT, _ExternT, encoding_state >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10335.html',1,'std']]], - ['codecvt_3c_20char_2c_20char_2c_20mbstate_5ft_20_3e_819',['codecvt< char, char, mbstate_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05203.html',1,'std']]], - ['codecvt_3c_20char16_5ft_2c_20char_2c_20mbstate_5ft_20_3e_820',['codecvt< char16_t, char, mbstate_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05211.html',1,'std']]], - ['codecvt_3c_20char32_5ft_2c_20char_2c_20mbstate_5ft_20_3e_821',['codecvt< char32_t, char, mbstate_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05215.html',1,'std']]], - ['codecvt_3c_20wchar_5ft_2c_20char_2c_20mbstate_5ft_20_3e_822',['codecvt< wchar_t, char, mbstate_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05207.html',1,'std']]], - ['codecvt_5fbase_823',['codecvt_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05191.html',1,'std']]], - ['codecvt_5fbyname_824',['codecvt_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05219.html',1,'std']]], - ['codecvt_5fspecializations_2eh_825',['codecvt_specializations.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01040.html',1,'']]], - ['coef_826',['coef',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#ac755378bf8f25e6340d5c0d690d93cb1',1,'cv::optflow::GPCTree::Node']]], - ['coef_827',['COEF',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3ae7112825b482d70cf5f04bc571f86e57',1,'cv::ml::SVM']]], - ['coeff_828',['coeff',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Eigen::Array::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Eigen::Array::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< double, DPARM_SIZE, 1 >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< double, DPARM_SIZE, 1 >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< double, UMFPACK_CONTROL, 1 >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< double, UMFPACK_CONTROL, 1 >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< double, UMFPACK_INFO, 1 >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< double, UMFPACK_INFO, 1 >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< Index, 1, Dynamic >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< Index, 1, Dynamic >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< int, IPARM_SIZE, 1 >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< int, IPARM_SIZE, 1 >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< RealScalar, Dynamic, 1 >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< RealScalar, Dynamic, 1 >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< StorageIndex, 2, 1 >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< StorageIndex, 2, 1 >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< StorageIndex, 64, 1, DontAlign >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< StorageIndex, 64, 1, DontAlign >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#aa7231d519967c37b4f98002d80756bda',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#af51b00cc45490ad698239ab6a8b94393',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::coeff(Index row, Index col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#aea142bb9ac9aa1b8c6b44f413daa4b88',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a6d8ebb28996655c441d5d744ac227c8d',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'Eigen::PlainObjectBase::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'Eigen::PlainObjectBase::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#aa4e1f964b34c76697bcdd3b54b84d814',1,'Eigen::SelfAdjointView::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#aa4e1f964b34c76697bcdd3b54b84d814',1,'SelfAdjointView< const Derived, UpLo >::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a195e66f79171f78cc22d91fff37e36e3',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a54adf6aa526045f37e67e352da8fd105',1,'Eigen::SparseMatrix::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a54adf6aa526045f37e67e352da8fd105',1,'SparseMatrix< Scalar >::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a54adf6aa526045f37e67e352da8fd105',1,'SparseMatrix< Scalar, ColMajor, int >::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a54adf6aa526045f37e67e352da8fd105',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a54adf6aa526045f37e67e352da8fd105',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a51093bbf9d6c6bad6a8afee9c93d4b3f',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::coeff()']]], - ['coefficient_20wise_20math_20functions_829',['Catalog of coefficient-wise math functions',['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'']]], - ['coefficient_20wise_20operations_830',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], - ['coeffobjectsizetotrack_831',['coeffObjectSizeToTrack',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a9687dc16c686bfa924b8f81672f07f5d',1,'cv::DetectionBasedTracker::InnerParameters']]], - ['coeffobjectspeedusinginprediction_832',['coeffObjectSpeedUsingInPrediction',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a7967591810eabddc5ecb13f28a45f213',1,'cv::DetectionBasedTracker::InnerParameters']]], - ['coeffref_833',['coeffRef',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Eigen::Array::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Eigen::Array::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Eigen::Array::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Eigen::Array::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< double, DPARM_SIZE, 1 >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< double, DPARM_SIZE, 1 >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< double, DPARM_SIZE, 1 >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< double, DPARM_SIZE, 1 >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< double, UMFPACK_CONTROL, 1 >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< double, UMFPACK_CONTROL, 1 >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< double, UMFPACK_CONTROL, 1 >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< double, UMFPACK_CONTROL, 1 >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< double, UMFPACK_INFO, 1 >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< double, UMFPACK_INFO, 1 >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< double, UMFPACK_INFO, 1 >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< double, UMFPACK_INFO, 1 >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< Index, 1, Dynamic >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< Index, 1, Dynamic >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< Index, 1, Dynamic >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< Index, 1, Dynamic >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< int, IPARM_SIZE, 1 >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< int, IPARM_SIZE, 1 >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< int, IPARM_SIZE, 1 >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< int, IPARM_SIZE, 1 >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< RealScalar, Dynamic, 1 >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< RealScalar, Dynamic, 1 >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< RealScalar, Dynamic, 1 >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< RealScalar, Dynamic, 1 >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< StorageIndex, 2, 1 >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< StorageIndex, 2, 1 >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< StorageIndex, 2, 1 >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< StorageIndex, 2, 1 >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< StorageIndex, 64, 1, DontAlign >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< StorageIndex, 64, 1, DontAlign >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< StorageIndex, 64, 1, DontAlign >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< StorageIndex, 64, 1, DontAlign >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#ae66b7d18b2a85f3139b703126974c900',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#adc8286576b31e11f056057be666a0ec8',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::coeffRef(Index row, Index col)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a474a755c6699eeeb9fd4fc70c502cdec',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#acaf91005e3230bbffe1c69a4199a0506',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Eigen::PlainObjectBase::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'Eigen::PlainObjectBase::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Eigen::PlainObjectBase::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'Eigen::PlainObjectBase::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ab5b030515fcee3d1d4f84c0d9d13bd67',1,'Eigen::SelfAdjointView::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ab5b030515fcee3d1d4f84c0d9d13bd67',1,'SelfAdjointView< const Derived, UpLo >::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html#aa9c42d48b9dd6f947ce3c257fe4bf2ca',1,'Eigen::SparseMapBase< Derived, WriteAccessors >::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a013197b3f598968ff37ed8c97087f1ef',1,'Eigen::SparseMatrix::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a013197b3f598968ff37ed8c97087f1ef',1,'SparseMatrix< Scalar >::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a013197b3f598968ff37ed8c97087f1ef',1,'SparseMatrix< Scalar, ColMajor, int >::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a013197b3f598968ff37ed8c97087f1ef',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a013197b3f598968ff37ed8c97087f1ef',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#ad512e8e607f3c537b5e1836eea3502f9',1,'Eigen::SparseVector::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#afb8cc8b16f27fa263757506e818f3e7f',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::coeffRef()']]], - ['coeffs_834',['coeffs',['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ab484a0fbbb43e22812b6211d878cddd4',1,'Eigen::Hyperplane::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a4a051414928ebb5803036b69aad597ca',1,'Eigen::Hyperplane::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ae61294790c0cc308d3f69690a657672c',1,'Eigen::QuaternionBase::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a193e79f616335a0067e3e784c7cf85fa',1,'Eigen::QuaternionBase::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ae61294790c0cc308d3f69690a657672c',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a193e79f616335a0067e3e784c7cf85fa',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ae61294790c0cc308d3f69690a657672c',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a193e79f616335a0067e3e784c7cf85fa',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ae61294790c0cc308d3f69690a657672c',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a193e79f616335a0067e3e784c7cf85fa',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'Eigen::SparseCompressedBase::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'Eigen::SparseCompressedBase::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< Derived >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< Derived >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< Transpose< MatrixType > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< Transpose< MatrixType > >::coeffs() const']]], - ['coefftrackingwindowsize_835',['coeffTrackingWindowSize',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a9fabef7efb531ebe2f0ba9d2ff06a253',1,'cv::DetectionBasedTracker::InnerParameters']]], - ['coeffvectortype_836',['CoeffVectorType',['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a567f99f3770365777b67bf9832b6fac1',1,'Eigen::HessenbergDecomposition::CoeffVectorType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a567f99f3770365777b67bf9832b6fac1',1,'HessenbergDecomposition< MatrixType >::CoeffVectorType']]], - ['col_837',['col',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#aac2b18c2ef3fbefc6f776cc313b966c0',1,'cv::cuda::GpuMat::col()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a6df72dc4291483b4c93251782abe2445',1,'cv::cudev::GpuMat_::col()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a23df02a07ffbfa4aa59c19bc003919fe',1,'cv::Mat::col()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a969438335ef8bb3da5232322e564d62b',1,'cv::Mat_::col()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a969438335ef8bb3da5232322e564d62b',1,'Mat_< double >::col()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a969438335ef8bb3da5232322e564d62b',1,'Mat_< float >::col()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a969438335ef8bb3da5232322e564d62b',1,'Mat_< uchar >::col()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a969438335ef8bb3da5232322e564d62b',1,'Mat_< unsigned char >::col()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae4aa2d04c89fa48df8d07913d897d7f9',1,'cv::MatExpr::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'cv::Matx::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< _Tp, cn, 1 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, 1, 3 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, 2, 2 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, 2, 3 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, 3, 3 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, 3, 4 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, 4, 4 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, cn, 1 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< float, 2, 3 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< float, 3, 3 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< float, cn, 1 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< float_type, 4, 4 >::col()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aaaa4b7216656ea35c63fcfc745c6995c',1,'cv::UMat::col()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Triplet.html#a3531e3e2098507a069a368d72d46471e',1,'Eigen::Triplet::col()']]], - ['col_5fsample_838',['COL_SAMPLE',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gga9c57a2b823008dda53d2c7f7059a8710a5c76025220c9a8f5dbd2e0e49783b214',1,'cv::ml::COL_SAMPLE'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gga9c57a2b823008dda53d2c7f7059a8710a5c76025220c9a8f5dbd2e0e49783b214',1,'COL_SAMPLE(Global Namespace)']]], - ['colamdordering_839',['COLAMDOrdering',['https://eigen.tuxfamily.org/dox/classEigen_1_1COLAMDOrdering.html',1,'Eigen']]], - ['colindices_840',['colIndices',['https://eigen.tuxfamily.org/dox/classEigen_1_1IndexedView.html#ae4abc26fe04506a02d49e704e112f5bf',1,'Eigen::IndexedView']]], - ['collate_841',['collate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html',1,'std::collate< _CharT >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#acd2238d0ec6436541c1f9f343e5e32d3',1,'std::locale::collate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#af79f640413431b317d0eef470792ebb3',1,'std::collate::collate(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a4c34c192809a224b1dfc6f3d6160e564',1,'std::collate::collate(__c_locale __cloc, size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a9a757dec2b2f903771da2427c292804a',1,'std::regex_constants::collate']]], - ['collate_5fbyname_842',['collate_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05899.html',1,'std']]], - ['collect_843',['collect',['https://docs.opencv.org/4.2.0/da/d6a/classcv_1_1face_1_1PredictCollector.html#ad67d7395e28845ee91be806ea093c4cd',1,'cv::face::PredictCollector::collect()'],['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#a685d8ba4a5541761fa252d99a36e6e33',1,'cv::face::StandardCollector::collect()']]], - ['collectgarbage_844',['collectGarbage',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a989f6582dd4c9789227405caa162e9b1',1,'cv::ximgproc::AdaptiveManifoldFilter::collectGarbage()'],['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#a6afb2a8465940e5ae46bfd0265132f3b',1,'cv::detail::BestOf2NearestMatcher::collectGarbage()'],['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1CLAHE.html#acfabd6cd7e533ddd11fa5b3591c07286',1,'cv::CLAHE::collectGarbage()'],['https://docs.opencv.org/4.2.0/df/dde/classcv_1_1DenseOpticalFlow.html#ada50da5295433ded930ddf32f681b80e',1,'cv::DenseOpticalFlow::collectGarbage()'],['https://docs.opencv.org/4.2.0/d1/d21/classcv_1_1superres_1_1DenseOpticalFlowExt.html#a5fbdddf5e0a27cf397794609da14a440',1,'cv::superres::DenseOpticalFlowExt::collectGarbage()'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a8520ff70e51e0bb138891ce410abf6e4',1,'cv::detail::FeaturesMatcher::collectGarbage()'],['https://docs.opencv.org/4.2.0/d5/d26/classcv_1_1cuda_1_1NvidiaHWOpticalFlow.html#a7b7679538d49adb53d614e63818275d6',1,'cv::cuda::NvidiaHWOpticalFlow::collectGarbage()'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#a20e30a8e3c15feb41f6db653c5b9f140',1,'cv::optflow::OpticalFlowPCAFlow::collectGarbage()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ac37de1a8bab83e86b3a540612dc2db1d',1,'cv::superres::SuperResolution::collectGarbage()']]], - ['collides_845',['collides',['../namespaceutil.html#a02e16f63251e3c2a45a1d6a2bde6b21a',1,'util']]], - ['colmajor_846',['ColMajor',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13a0103672ae41005ab03b4176c765afd62',1,'Eigen::ColMajor'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13a0103672ae41005ab03b4176c765afd62',1,'ColMajor(Global Namespace)']]], - ['color_847',['Color',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html',1,'cv::viz']]], - ['color_848',['COLOR',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a6ce104a17b48a0503ccdcf4787ba2ef3aa9485acd73bb7982e3b2d853d6b12947',1,'cv::detail::DpSeamFinder']]], - ['color_849',['Color',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#aba7de64923e52365d94def373007ae50',1,'cv::viz::Viz3d::Color'],['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a56ea927fa87f33b34bd96edbebf155b3',1,'cv::viz::Color::Color()'],['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a59c0626777297c2c854cfa8129c911fc',1,'cv::viz::Color::Color(double gray)'],['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a76aa939614074556af659295fa87a02a',1,'cv::viz::Color::Color(double blue, double green, double red)'],['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a3200c2af3a4a34e87ea1431fd8af4320',1,'cv::viz::Color::Color(const Scalar &color)']]], - ['color_850',['color',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#a4e6d015bea8d7ea6c654ffebdbcb6a6e',1,'cv::gapi::wip::draw::Circle::color'],['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#a215bf1579794eb17360d5eb9ccae68c4',1,'cv::gapi::wip::draw::FText::color'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#a37ee00e2e9bb1925dd725eadd080a776',1,'cv::gapi::wip::draw::Line::color'],['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#a00a13eaa745f446dd1eb42c15eb129a1',1,'cv::gapi::wip::draw::Poly::color'],['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a87c73b5094c4884e93c4a20a0691ac97',1,'cv::QtFont::color'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html#a8b3cefcaa0903dde4db0722e0ec15b63',1,'cv::gapi::wip::draw::Rect::color'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a766270fb50948f67ae1cc47348c29786',1,'cv::gapi::wip::draw::Text::color']]], - ['color_20conversions_851',['Color conversions',['https://docs.opencv.org/4.2.0/de/d25/imgproc_color_conversions.html',1,'']]], - ['color_20palette_852',['Trackbar as the Color Palette',['https://docs.opencv.org/4.2.0/d9/dc8/tutorial_py_trackbar.html',1,'']]], - ['color_20space_20conversions_853',['Color Space Conversions',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html',1,'']]], - ['color_20space_20processing_854',['Color space processing',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html',1,'']]], - ['color_20space_20to_20another_855',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], - ['color_2ehpp_856',['color.hpp',['https://docs.opencv.org/4.2.0/d1/d71/modules_2core_2include_2opencv2_2core_2cuda_2color_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d7a/contrib_2modules_2cudev_2include_2opencv2_2cudev_2expr_2color_8hpp.html',1,'(Global Namespace)']]], - ['color_5fbayerbg2bgr_857',['COLOR_BayerBG2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8945844ab075687f4d4196abe1ce0db4',1,'cv::COLOR_BayerBG2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8945844ab075687f4d4196abe1ce0db4',1,'COLOR_BayerBG2BGR(Global Namespace)']]], - ['color_5fbayerbg2bgr_5fea_858',['COLOR_BayerBG2BGR_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af945cf163b1b5d01b69feabfe10d62bc',1,'cv::COLOR_BayerBG2BGR_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af945cf163b1b5d01b69feabfe10d62bc',1,'COLOR_BayerBG2BGR_EA(Global Namespace)']]], - ['color_5fbayerbg2bgr_5fmht_859',['COLOR_BayerBG2BGR_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9addf009a20751e8b5e3f35e0a6e6a6494',1,'cv::cuda::COLOR_BayerBG2BGR_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9addf009a20751e8b5e3f35e0a6e6a6494',1,'COLOR_BayerBG2BGR_MHT(Global Namespace)']]], - ['color_5fbayerbg2bgr_5fvng_860',['COLOR_BayerBG2BGR_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a03fa881afa10795e9f4344a50b80db7f',1,'cv::COLOR_BayerBG2BGR_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a03fa881afa10795e9f4344a50b80db7f',1,'COLOR_BayerBG2BGR_VNG(Global Namespace)']]], - ['color_5fbayerbg2bgra_861',['COLOR_BayerBG2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a64d2dcd6fd8f41e865801fda7a2b75e4',1,'cv::COLOR_BayerBG2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a64d2dcd6fd8f41e865801fda7a2b75e4',1,'COLOR_BayerBG2BGRA(Global Namespace)']]], - ['color_5fbayerbg2gray_862',['COLOR_BayerBG2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a08febd33b0214417dd33a7fb014bf99a',1,'cv::COLOR_BayerBG2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a08febd33b0214417dd33a7fb014bf99a',1,'COLOR_BayerBG2GRAY(Global Namespace)']]], - ['color_5fbayerbg2gray_5fmht_863',['COLOR_BayerBG2GRAY_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9aad9130613cf3bbd1c139eed3ce964602',1,'cv::cuda::COLOR_BayerBG2GRAY_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9aad9130613cf3bbd1c139eed3ce964602',1,'COLOR_BayerBG2GRAY_MHT(Global Namespace)']]], - ['color_5fbayerbg2rgb_864',['COLOR_BayerBG2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abb38ecd5317747c872d3775196abe142',1,'cv::COLOR_BayerBG2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abb38ecd5317747c872d3775196abe142',1,'COLOR_BayerBG2RGB(Global Namespace)']]], - ['color_5fbayerbg2rgb_5fea_865',['COLOR_BayerBG2RGB_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad9c5f421182bb1c1fccf50de67c84686',1,'cv::COLOR_BayerBG2RGB_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad9c5f421182bb1c1fccf50de67c84686',1,'COLOR_BayerBG2RGB_EA(Global Namespace)']]], - ['color_5fbayerbg2rgb_5fmht_866',['COLOR_BayerBG2RGB_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a954a78abfff350f7df5c9d4924c10bef',1,'cv::cuda::COLOR_BayerBG2RGB_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a954a78abfff350f7df5c9d4924c10bef',1,'COLOR_BayerBG2RGB_MHT(Global Namespace)']]], - ['color_5fbayerbg2rgb_5fvng_867',['COLOR_BayerBG2RGB_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a212329fc4bd4fbbad13243d1ac2251f2',1,'cv::COLOR_BayerBG2RGB_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a212329fc4bd4fbbad13243d1ac2251f2',1,'COLOR_BayerBG2RGB_VNG(Global Namespace)']]], - ['color_5fbayerbg2rgba_868',['COLOR_BayerBG2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae80c95f834b3b7038ba2facf544b0d9b',1,'cv::COLOR_BayerBG2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae80c95f834b3b7038ba2facf544b0d9b',1,'COLOR_BayerBG2RGBA(Global Namespace)']]], - ['color_5fbayergb2bgr_869',['COLOR_BayerGB2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acef801137d9696dcb622122a7ef266c6',1,'cv::COLOR_BayerGB2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acef801137d9696dcb622122a7ef266c6',1,'COLOR_BayerGB2BGR(Global Namespace)']]], - ['color_5fbayergb2bgr_5fea_870',['COLOR_BayerGB2BGR_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3ac0015fd225d6e02485c822fb26b4b6',1,'cv::COLOR_BayerGB2BGR_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3ac0015fd225d6e02485c822fb26b4b6',1,'COLOR_BayerGB2BGR_EA(Global Namespace)']]], - ['color_5fbayergb2bgr_5fmht_871',['COLOR_BayerGB2BGR_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9ae7ed117e179385954505a127492a3f71',1,'cv::cuda::COLOR_BayerGB2BGR_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9ae7ed117e179385954505a127492a3f71',1,'COLOR_BayerGB2BGR_MHT(Global Namespace)']]], - ['color_5fbayergb2bgr_5fvng_872',['COLOR_BayerGB2BGR_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae47bd67001d93fbee5638f61ce256b68',1,'cv::COLOR_BayerGB2BGR_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae47bd67001d93fbee5638f61ce256b68',1,'COLOR_BayerGB2BGR_VNG(Global Namespace)']]], - ['color_5fbayergb2bgra_873',['COLOR_BayerGB2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ace94e0ec556c55476cd451fbcd411bb8',1,'cv::COLOR_BayerGB2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ace94e0ec556c55476cd451fbcd411bb8',1,'COLOR_BayerGB2BGRA(Global Namespace)']]], - ['color_5fbayergb2gray_874',['COLOR_BayerGB2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a63667769d13ad6dff2b5a296f4c966d2',1,'cv::COLOR_BayerGB2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a63667769d13ad6dff2b5a296f4c966d2',1,'COLOR_BayerGB2GRAY(Global Namespace)']]], - ['color_5fbayergb2gray_5fmht_875',['COLOR_BayerGB2GRAY_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a3b7d66377d5b0265d5f0bb5f3ca5b8bc',1,'cv::cuda::COLOR_BayerGB2GRAY_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a3b7d66377d5b0265d5f0bb5f3ca5b8bc',1,'COLOR_BayerGB2GRAY_MHT(Global Namespace)']]], - ['color_5fbayergb2rgb_876',['COLOR_BayerGB2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a93f007ad1b8f904f6e8c54dd8ccd4049',1,'cv::COLOR_BayerGB2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a93f007ad1b8f904f6e8c54dd8ccd4049',1,'COLOR_BayerGB2RGB(Global Namespace)']]], - ['color_5fbayergb2rgb_5fea_877',['COLOR_BayerGB2RGB_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2592253337e4790bf01bad9e0eee5619',1,'cv::COLOR_BayerGB2RGB_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2592253337e4790bf01bad9e0eee5619',1,'COLOR_BayerGB2RGB_EA(Global Namespace)']]], - ['color_5fbayergb2rgb_5fmht_878',['COLOR_BayerGB2RGB_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a0846825de742426ac98e8342496e4f71',1,'cv::cuda::COLOR_BayerGB2RGB_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a0846825de742426ac98e8342496e4f71',1,'COLOR_BayerGB2RGB_MHT(Global Namespace)']]], - ['color_5fbayergb2rgb_5fvng_879',['COLOR_BayerGB2RGB_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae80631e50e83917297c2ff2c328da841',1,'cv::COLOR_BayerGB2RGB_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae80631e50e83917297c2ff2c328da841',1,'COLOR_BayerGB2RGB_VNG(Global Namespace)']]], - ['color_5fbayergb2rgba_880',['COLOR_BayerGB2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7c7aab61b00caa7099a2e008db0ff083',1,'cv::COLOR_BayerGB2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7c7aab61b00caa7099a2e008db0ff083',1,'COLOR_BayerGB2RGBA(Global Namespace)']]], - ['color_5fbayergr2bgr_881',['COLOR_BayerGR2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afe3d71ad80f5f067d3d76b376cf8d951',1,'cv::COLOR_BayerGR2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afe3d71ad80f5f067d3d76b376cf8d951',1,'COLOR_BayerGR2BGR(Global Namespace)']]], - ['color_5fbayergr2bgr_5fea_882',['COLOR_BayerGR2BGR_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af51a3d5aceb2256a59c3a4c8e499d7e3',1,'cv::COLOR_BayerGR2BGR_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af51a3d5aceb2256a59c3a4c8e499d7e3',1,'COLOR_BayerGR2BGR_EA(Global Namespace)']]], - ['color_5fbayergr2bgr_5fmht_883',['COLOR_BayerGR2BGR_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a370dd60e4d1fe51c51a5a90d250ac8b1',1,'cv::cuda::COLOR_BayerGR2BGR_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a370dd60e4d1fe51c51a5a90d250ac8b1',1,'COLOR_BayerGR2BGR_MHT(Global Namespace)']]], - ['color_5fbayergr2bgr_5fvng_884',['COLOR_BayerGR2BGR_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad787e2911c5b21eaf4d7ffe6f85ad5a8',1,'cv::COLOR_BayerGR2BGR_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad787e2911c5b21eaf4d7ffe6f85ad5a8',1,'COLOR_BayerGR2BGR_VNG(Global Namespace)']]], - ['color_5fbayergr2bgra_885',['COLOR_BayerGR2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a850bc919c36bb360f1270ffb9f839532',1,'cv::COLOR_BayerGR2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a850bc919c36bb360f1270ffb9f839532',1,'COLOR_BayerGR2BGRA(Global Namespace)']]], - ['color_5fbayergr2gray_886',['COLOR_BayerGR2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aaab526ce2ad4ce74603c711b3c22a38a',1,'cv::COLOR_BayerGR2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aaab526ce2ad4ce74603c711b3c22a38a',1,'COLOR_BayerGR2GRAY(Global Namespace)']]], - ['color_5fbayergr2gray_5fmht_887',['COLOR_BayerGR2GRAY_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a401bb8e159ec835ee3dd035a1af473b9',1,'cv::cuda::COLOR_BayerGR2GRAY_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a401bb8e159ec835ee3dd035a1af473b9',1,'COLOR_BayerGR2GRAY_MHT(Global Namespace)']]], - ['color_5fbayergr2rgb_888',['COLOR_BayerGR2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aac8c643ccf0c9d9407bd0cb9a18520d2',1,'cv::COLOR_BayerGR2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aac8c643ccf0c9d9407bd0cb9a18520d2',1,'COLOR_BayerGR2RGB(Global Namespace)']]], - ['color_5fbayergr2rgb_5fea_889',['COLOR_BayerGR2RGB_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af6c182db5d5c2bc25a349caeb02ee59e',1,'cv::COLOR_BayerGR2RGB_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af6c182db5d5c2bc25a349caeb02ee59e',1,'COLOR_BayerGR2RGB_EA(Global Namespace)']]], - ['color_5fbayergr2rgb_5fmht_890',['COLOR_BayerGR2RGB_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a344694fbc10ea8ba9c6f18c220d91174',1,'cv::cuda::COLOR_BayerGR2RGB_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a344694fbc10ea8ba9c6f18c220d91174',1,'COLOR_BayerGR2RGB_MHT(Global Namespace)']]], - ['color_5fbayergr2rgb_5fvng_891',['COLOR_BayerGR2RGB_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ace5b476881d97cb22627eb333c9655d6',1,'cv::COLOR_BayerGR2RGB_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ace5b476881d97cb22627eb333c9655d6',1,'COLOR_BayerGR2RGB_VNG(Global Namespace)']]], - ['color_5fbayergr2rgba_892',['COLOR_BayerGR2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7dfeef02dd5d9d7b907e3aece0e87098',1,'cv::COLOR_BayerGR2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7dfeef02dd5d9d7b907e3aece0e87098',1,'COLOR_BayerGR2RGBA(Global Namespace)']]], - ['color_5fbayerrg2bgr_893',['COLOR_BayerRG2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a275d4d0ff99fdf45b2b6b421a14ec831',1,'cv::COLOR_BayerRG2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a275d4d0ff99fdf45b2b6b421a14ec831',1,'COLOR_BayerRG2BGR(Global Namespace)']]], - ['color_5fbayerrg2bgr_5fea_894',['COLOR_BayerRG2BGR_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a9a7ff84cd856119c6c5b8ecb81ba9284',1,'cv::COLOR_BayerRG2BGR_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a9a7ff84cd856119c6c5b8ecb81ba9284',1,'COLOR_BayerRG2BGR_EA(Global Namespace)']]], - ['color_5fbayerrg2bgr_5fmht_895',['COLOR_BayerRG2BGR_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a3539d4ab50d2386af8f4033e0a4aca7d',1,'cv::cuda::COLOR_BayerRG2BGR_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a3539d4ab50d2386af8f4033e0a4aca7d',1,'COLOR_BayerRG2BGR_MHT(Global Namespace)']]], - ['color_5fbayerrg2bgr_5fvng_896',['COLOR_BayerRG2BGR_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad298bb184eda5bf3a58fbc4e509c0e43',1,'cv::COLOR_BayerRG2BGR_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad298bb184eda5bf3a58fbc4e509c0e43',1,'COLOR_BayerRG2BGR_VNG(Global Namespace)']]], - ['color_5fbayerrg2bgra_897',['COLOR_BayerRG2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af3d528d5f0f7c24ac08dd5e5a8f19ddc',1,'cv::COLOR_BayerRG2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af3d528d5f0f7c24ac08dd5e5a8f19ddc',1,'COLOR_BayerRG2BGRA(Global Namespace)']]], - ['color_5fbayerrg2gray_898',['COLOR_BayerRG2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad4fbbce0080be39beb5397716bac3ccc',1,'cv::COLOR_BayerRG2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad4fbbce0080be39beb5397716bac3ccc',1,'COLOR_BayerRG2GRAY(Global Namespace)']]], - ['color_5fbayerrg2gray_5fmht_899',['COLOR_BayerRG2GRAY_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a6e63778d3e4aa13d21aa74a8124e2afb',1,'cv::cuda::COLOR_BayerRG2GRAY_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a6e63778d3e4aa13d21aa74a8124e2afb',1,'COLOR_BayerRG2GRAY_MHT(Global Namespace)']]], - ['color_5fbayerrg2rgb_900',['COLOR_BayerRG2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ade83fb9a89e974207e5fef472f28adf3',1,'cv::COLOR_BayerRG2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ade83fb9a89e974207e5fef472f28adf3',1,'COLOR_BayerRG2RGB(Global Namespace)']]], - ['color_5fbayerrg2rgb_5fea_901',['COLOR_BayerRG2RGB_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac71ff26b3666986f20fdc33e749a67a4',1,'cv::COLOR_BayerRG2RGB_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac71ff26b3666986f20fdc33e749a67a4',1,'COLOR_BayerRG2RGB_EA(Global Namespace)']]], - ['color_5fbayerrg2rgb_5fmht_902',['COLOR_BayerRG2RGB_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9abd4996d237d3a632990d94db73385f74',1,'cv::cuda::COLOR_BayerRG2RGB_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9abd4996d237d3a632990d94db73385f74',1,'COLOR_BayerRG2RGB_MHT(Global Namespace)']]], - ['color_5fbayerrg2rgb_5fvng_903',['COLOR_BayerRG2RGB_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aafd52baa924f361873e0a0cec1cf9667',1,'cv::COLOR_BayerRG2RGB_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aafd52baa924f361873e0a0cec1cf9667',1,'COLOR_BayerRG2RGB_VNG(Global Namespace)']]], - ['color_5fbayerrg2rgba_904',['COLOR_BayerRG2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2a80354788f54d0bed59fa44ea2fb98e',1,'cv::COLOR_BayerRG2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2a80354788f54d0bed59fa44ea2fb98e',1,'COLOR_BayerRG2RGBA(Global Namespace)']]], - ['color_5fbgr2bgr555_905',['COLOR_BGR2BGR555',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acf67881c46eb58292f1591ba1378ced1',1,'cv::COLOR_BGR2BGR555'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acf67881c46eb58292f1591ba1378ced1',1,'COLOR_BGR2BGR555(Global Namespace)']]], - ['color_5fbgr2bgr565_906',['COLOR_BGR2BGR565',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae353073865366f7c70fcf584797f05df',1,'cv::COLOR_BGR2BGR565'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae353073865366f7c70fcf584797f05df',1,'COLOR_BGR2BGR565(Global Namespace)']]], - ['color_5fbgr2bgra_907',['COLOR_BGR2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a95d70bf0c1b5aa58d1eb8abf03161f21',1,'cv::COLOR_BGR2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a95d70bf0c1b5aa58d1eb8abf03161f21',1,'COLOR_BGR2BGRA(Global Namespace)']]], - ['color_5fbgr2gray_908',['COLOR_BGR2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a353a4b8db9040165db4dacb5bcefb6ea',1,'cv::COLOR_BGR2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a353a4b8db9040165db4dacb5bcefb6ea',1,'COLOR_BGR2GRAY(Global Namespace)']]], - ['color_5fbgr2hls_909',['COLOR_BGR2HLS',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3070ca753ff41d655e87315bee03d8af',1,'cv::COLOR_BGR2HLS'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3070ca753ff41d655e87315bee03d8af',1,'COLOR_BGR2HLS(Global Namespace)']]], - ['color_5fbgr2hls_5ffull_910',['COLOR_BGR2HLS_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae2cb61868a2157317f8c37fcd3e35a50',1,'cv::COLOR_BGR2HLS_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae2cb61868a2157317f8c37fcd3e35a50',1,'COLOR_BGR2HLS_FULL(Global Namespace)']]], - ['color_5fbgr2hsv_911',['COLOR_BGR2HSV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa4a7f0ecf2e94150699e48c79139ee12',1,'cv::COLOR_BGR2HSV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa4a7f0ecf2e94150699e48c79139ee12',1,'COLOR_BGR2HSV(Global Namespace)']]], - ['color_5fbgr2hsv_5ffull_912',['COLOR_BGR2HSV_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2dd48d4bc63904a55500a4ef5608f7e1',1,'cv::COLOR_BGR2HSV_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2dd48d4bc63904a55500a4ef5608f7e1',1,'COLOR_BGR2HSV_FULL(Global Namespace)']]], - ['color_5fbgr2lab_913',['COLOR_BGR2Lab',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a860b72b4741c431e81340fafef5eca24',1,'cv::COLOR_BGR2Lab'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a860b72b4741c431e81340fafef5eca24',1,'COLOR_BGR2Lab(Global Namespace)']]], - ['color_5fbgr2luv_914',['COLOR_BGR2Luv',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8199112edf021b1586c75ca20a46ecd1',1,'cv::COLOR_BGR2Luv'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8199112edf021b1586c75ca20a46ecd1',1,'COLOR_BGR2Luv(Global Namespace)']]], - ['color_5fbgr2rgb_915',['COLOR_BGR2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad3db9ff253b87d02efe4887b2f5d77ee',1,'cv::COLOR_BGR2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad3db9ff253b87d02efe4887b2f5d77ee',1,'COLOR_BGR2RGB(Global Namespace)']]], - ['color_5fbgr2rgba_916',['COLOR_BGR2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a9cef93380497571d867d18149c268ed1',1,'cv::COLOR_BGR2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a9cef93380497571d867d18149c268ed1',1,'COLOR_BGR2RGBA(Global Namespace)']]], - ['color_5fbgr2xyz_917',['COLOR_BGR2XYZ',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab3b3aba03d2e2a92fbd7564efd47e38b',1,'cv::COLOR_BGR2XYZ'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab3b3aba03d2e2a92fbd7564efd47e38b',1,'COLOR_BGR2XYZ(Global Namespace)']]], - ['color_5fbgr2ycrcb_918',['COLOR_BGR2YCrCb',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a63f063ef276a066c4e122997cfd55d6e',1,'cv::COLOR_BGR2YCrCb'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a63f063ef276a066c4e122997cfd55d6e',1,'COLOR_BGR2YCrCb(Global Namespace)']]], - ['color_5fbgr2yuv_919',['COLOR_BGR2YUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a611d58d4a431fdbc294b4c79701f3d1a',1,'cv::COLOR_BGR2YUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a611d58d4a431fdbc294b4c79701f3d1a',1,'COLOR_BGR2YUV(Global Namespace)']]], - ['color_5fbgr2yuv_5fi420_920',['COLOR_BGR2YUV_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae755aac1b6d7903bdc798f9246a0e47a',1,'cv::COLOR_BGR2YUV_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae755aac1b6d7903bdc798f9246a0e47a',1,'COLOR_BGR2YUV_I420(Global Namespace)']]], - ['color_5fbgr2yuv_5fiyuv_921',['COLOR_BGR2YUV_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae21fa301a150cb9bfb80eab5bdb0b547',1,'cv::COLOR_BGR2YUV_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae21fa301a150cb9bfb80eab5bdb0b547',1,'COLOR_BGR2YUV_IYUV(Global Namespace)']]], - ['color_5fbgr2yuv_5fyv12_922',['COLOR_BGR2YUV_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0affdc3f6b1d2e3161c2773ec67b9eec01',1,'cv::COLOR_BGR2YUV_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0affdc3f6b1d2e3161c2773ec67b9eec01',1,'COLOR_BGR2YUV_YV12(Global Namespace)']]], - ['color_5fbgr5552bgr_923',['COLOR_BGR5552BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab22ef0b60e63861795e13bca6ae9432f',1,'cv::COLOR_BGR5552BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab22ef0b60e63861795e13bca6ae9432f',1,'COLOR_BGR5552BGR(Global Namespace)']]], - ['color_5fbgr5552bgra_924',['COLOR_BGR5552BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a88bd4303c12c5de2885ad800af09db2e',1,'cv::COLOR_BGR5552BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a88bd4303c12c5de2885ad800af09db2e',1,'COLOR_BGR5552BGRA(Global Namespace)']]], - ['color_5fbgr5552gray_925',['COLOR_BGR5552GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4c826fdf9d60ae16488ffaa450f9ff5a',1,'cv::COLOR_BGR5552GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4c826fdf9d60ae16488ffaa450f9ff5a',1,'COLOR_BGR5552GRAY(Global Namespace)']]], - ['color_5fbgr5552rgb_926',['COLOR_BGR5552RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a76fa45576fa678e0fd6c562dfe7c52d2',1,'cv::COLOR_BGR5552RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a76fa45576fa678e0fd6c562dfe7c52d2',1,'COLOR_BGR5552RGB(Global Namespace)']]], - ['color_5fbgr5552rgba_927',['COLOR_BGR5552RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a80ca6a02328711a35c6ab1ea88f6d9ac',1,'cv::COLOR_BGR5552RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a80ca6a02328711a35c6ab1ea88f6d9ac',1,'COLOR_BGR5552RGBA(Global Namespace)']]], - ['color_5fbgr5652bgr_928',['COLOR_BGR5652BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af388d43f640a979fa93adf27f16973aa',1,'cv::COLOR_BGR5652BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af388d43f640a979fa93adf27f16973aa',1,'COLOR_BGR5652BGR(Global Namespace)']]], - ['color_5fbgr5652bgra_929',['COLOR_BGR5652BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a485bce6c1fe6a13a95157840bd572fa3',1,'cv::COLOR_BGR5652BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a485bce6c1fe6a13a95157840bd572fa3',1,'COLOR_BGR5652BGRA(Global Namespace)']]], - ['color_5fbgr5652gray_930',['COLOR_BGR5652GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a71cb89814fc07c4bff35bc374de239d9',1,'cv::COLOR_BGR5652GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a71cb89814fc07c4bff35bc374de239d9',1,'COLOR_BGR5652GRAY(Global Namespace)']]], - ['color_5fbgr5652rgb_931',['COLOR_BGR5652RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aba428b6099680ca449616b67bfa4d4dd',1,'cv::COLOR_BGR5652RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aba428b6099680ca449616b67bfa4d4dd',1,'COLOR_BGR5652RGB(Global Namespace)']]], - ['color_5fbgr5652rgba_932',['COLOR_BGR5652RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aae2022279d9c6435a081b7fb93dc42c4',1,'cv::COLOR_BGR5652RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aae2022279d9c6435a081b7fb93dc42c4',1,'COLOR_BGR5652RGBA(Global Namespace)']]], - ['color_5fbgra2bgr_933',['COLOR_BGRA2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3a7148dd1537f09d35b69690b0548798',1,'cv::COLOR_BGRA2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3a7148dd1537f09d35b69690b0548798',1,'COLOR_BGRA2BGR(Global Namespace)']]], - ['color_5fbgra2bgr555_934',['COLOR_BGRA2BGR555',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae4cb06b90fdec292979d0e0ec6d021c9',1,'cv::COLOR_BGRA2BGR555'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae4cb06b90fdec292979d0e0ec6d021c9',1,'COLOR_BGRA2BGR555(Global Namespace)']]], - ['color_5fbgra2bgr565_935',['COLOR_BGRA2BGR565',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aed987d3698f96dbfb162f95cff34deb1',1,'cv::COLOR_BGRA2BGR565'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aed987d3698f96dbfb162f95cff34deb1',1,'COLOR_BGRA2BGR565(Global Namespace)']]], - ['color_5fbgra2gray_936',['COLOR_BGRA2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af0b29b81ffc329681ad9388af7e76b01',1,'cv::COLOR_BGRA2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af0b29b81ffc329681ad9388af7e76b01',1,'COLOR_BGRA2GRAY(Global Namespace)']]], - ['color_5fbgra2rgb_937',['COLOR_BGRA2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a610c1faaa2c8b6065a9c84203d5da232',1,'cv::COLOR_BGRA2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a610c1faaa2c8b6065a9c84203d5da232',1,'COLOR_BGRA2RGB(Global Namespace)']]], - ['color_5fbgra2rgba_938',['COLOR_BGRA2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a06d2c61b23b77b9a3075388146ba5180',1,'cv::COLOR_BGRA2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a06d2c61b23b77b9a3075388146ba5180',1,'COLOR_BGRA2RGBA(Global Namespace)']]], - ['color_5fbgra2yuv_5fi420_939',['COLOR_BGRA2YUV_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae9c2defc5268f6c7938895b0f675df08',1,'cv::COLOR_BGRA2YUV_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae9c2defc5268f6c7938895b0f675df08',1,'COLOR_BGRA2YUV_I420(Global Namespace)']]], - ['color_5fbgra2yuv_5fiyuv_940',['COLOR_BGRA2YUV_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a64843a51caea1694321bd3a857aa35e3',1,'cv::COLOR_BGRA2YUV_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a64843a51caea1694321bd3a857aa35e3',1,'COLOR_BGRA2YUV_IYUV(Global Namespace)']]], - ['color_5fbgra2yuv_5fyv12_941',['COLOR_BGRA2YUV_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1b016fc90c37ba19b9bf41198a392eaa',1,'cv::COLOR_BGRA2YUV_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1b016fc90c37ba19b9bf41198a392eaa',1,'COLOR_BGRA2YUV_YV12(Global Namespace)']]], - ['color_5fcolorcvt_5fmax_942',['COLOR_COLORCVT_MAX',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a926d8b1b6943881b205f76fc14cdf244',1,'cv::COLOR_COLORCVT_MAX'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a926d8b1b6943881b205f76fc14cdf244',1,'COLOR_COLORCVT_MAX(Global Namespace)']]], - ['color_5fcvt_2ehpp_943',['color_cvt.hpp',['https://docs.opencv.org/4.2.0/db/dcf/color__cvt_8hpp.html',1,'']]], - ['color_5fgrad_944',['COLOR_GRAD',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a6ce104a17b48a0503ccdcf4787ba2ef3a306cd9d1479580c01f8d2ffa5328917b',1,'cv::detail::DpSeamFinder']]], - ['color_5fgray2bgr_945',['COLOR_GRAY2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a869da65c045477f2f17d39395df65b2d',1,'cv::COLOR_GRAY2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a869da65c045477f2f17d39395df65b2d',1,'COLOR_GRAY2BGR(Global Namespace)']]], - ['color_5fgray2bgr555_946',['COLOR_GRAY2BGR555',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a739351593dfc5c3917e4b39fe4f12e0f',1,'cv::COLOR_GRAY2BGR555'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a739351593dfc5c3917e4b39fe4f12e0f',1,'COLOR_GRAY2BGR555(Global Namespace)']]], - ['color_5fgray2bgr565_947',['COLOR_GRAY2BGR565',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a898758d335300e306c66f1bfc3cc6aab',1,'cv::COLOR_GRAY2BGR565'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a898758d335300e306c66f1bfc3cc6aab',1,'COLOR_GRAY2BGR565(Global Namespace)']]], - ['color_5fgray2bgra_948',['COLOR_GRAY2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acab34eea440d5a100e82141f86d29f5f',1,'cv::COLOR_GRAY2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acab34eea440d5a100e82141f86d29f5f',1,'COLOR_GRAY2BGRA(Global Namespace)']]], - ['color_5fgray2rgb_949',['COLOR_GRAY2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a164663625b9c473f69dd47cdd7a31acc',1,'cv::COLOR_GRAY2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a164663625b9c473f69dd47cdd7a31acc',1,'COLOR_GRAY2RGB(Global Namespace)']]], - ['color_5fgray2rgba_950',['COLOR_GRAY2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aecc1b054bb042ee91478e591cf1f19b8',1,'cv::COLOR_GRAY2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aecc1b054bb042ee91478e591cf1f19b8',1,'COLOR_GRAY2RGBA(Global Namespace)']]], - ['color_5fhls2bgr_951',['COLOR_HLS2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1dc9f081ce5202ade309e319414c14cd',1,'cv::COLOR_HLS2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1dc9f081ce5202ade309e319414c14cd',1,'COLOR_HLS2BGR(Global Namespace)']]], - ['color_5fhls2bgr_5ffull_952',['COLOR_HLS2BGR_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a74b8be5439286eb365360c3af65bd938',1,'cv::COLOR_HLS2BGR_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a74b8be5439286eb365360c3af65bd938',1,'COLOR_HLS2BGR_FULL(Global Namespace)']]], - ['color_5fhls2rgb_953',['COLOR_HLS2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a501d0d119ebbf50ddbbf3743f2783aca',1,'cv::COLOR_HLS2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a501d0d119ebbf50ddbbf3743f2783aca',1,'COLOR_HLS2RGB(Global Namespace)']]], - ['color_5fhls2rgb_5ffull_954',['COLOR_HLS2RGB_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a5bb4b7196825e755f6f6eb99653c2dd5',1,'cv::COLOR_HLS2RGB_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a5bb4b7196825e755f6f6eb99653c2dd5',1,'COLOR_HLS2RGB_FULL(Global Namespace)']]], - ['color_5fhsv2bgr_955',['COLOR_HSV2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2a4b11ff7d29c342b66b85962a7969cd',1,'cv::COLOR_HSV2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2a4b11ff7d29c342b66b85962a7969cd',1,'COLOR_HSV2BGR(Global Namespace)']]], - ['color_5fhsv2bgr_5ffull_956',['COLOR_HSV2BGR_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a752b22a2fc75d74d504db1102357d784',1,'cv::COLOR_HSV2BGR_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a752b22a2fc75d74d504db1102357d784',1,'COLOR_HSV2BGR_FULL(Global Namespace)']]], - ['color_5fhsv2rgb_957',['COLOR_HSV2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a348965e2c1baf8e2c78c9afc17ac3de2',1,'cv::COLOR_HSV2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a348965e2c1baf8e2c78c9afc17ac3de2',1,'COLOR_HSV2RGB(Global Namespace)']]], - ['color_5fhsv2rgb_5ffull_958',['COLOR_HSV2RGB_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a995659971a31fad980de36ca00e14f3e',1,'cv::COLOR_HSV2RGB_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a995659971a31fad980de36ca00e14f3e',1,'COLOR_HSV2RGB_FULL(Global Namespace)']]], - ['color_5flab2bgr_959',['COLOR_Lab2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a966fd47d10ad71c4220b3ef9f1ac5774',1,'cv::COLOR_Lab2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a966fd47d10ad71c4220b3ef9f1ac5774',1,'COLOR_Lab2BGR(Global Namespace)']]], - ['color_5flab2lbgr_960',['COLOR_Lab2LBGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa29be3cb6dcbe7e33e7a0cf93bda4ce5',1,'cv::COLOR_Lab2LBGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa29be3cb6dcbe7e33e7a0cf93bda4ce5',1,'COLOR_Lab2LBGR(Global Namespace)']]], - ['color_5flab2lrgb_961',['COLOR_Lab2LRGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0ed4c859218edf4a60dc11c0c283ae37',1,'cv::COLOR_Lab2LRGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0ed4c859218edf4a60dc11c0c283ae37',1,'COLOR_Lab2LRGB(Global Namespace)']]], - ['color_5flab2rgb_962',['COLOR_Lab2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a50988b0e1e8369628a55cc8860dfbf69',1,'cv::COLOR_Lab2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a50988b0e1e8369628a55cc8860dfbf69',1,'COLOR_Lab2RGB(Global Namespace)']]], - ['color_5flbgr2lab_963',['COLOR_LBGR2Lab',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa8e6dba26491ccf877a10a050db34627',1,'cv::COLOR_LBGR2Lab'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa8e6dba26491ccf877a10a050db34627',1,'COLOR_LBGR2Lab(Global Namespace)']]], - ['color_5flbgr2luv_964',['COLOR_LBGR2Luv',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1dac1906d1b5a04822e55ce6b8f236ec',1,'cv::COLOR_LBGR2Luv'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1dac1906d1b5a04822e55ce6b8f236ec',1,'COLOR_LBGR2Luv(Global Namespace)']]], - ['color_5flrgb2lab_965',['COLOR_LRGB2Lab',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a91c5ba94272235045f917e1ca06ac695',1,'cv::COLOR_LRGB2Lab'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a91c5ba94272235045f917e1ca06ac695',1,'COLOR_LRGB2Lab(Global Namespace)']]], - ['color_5flrgb2luv_966',['COLOR_LRGB2Luv',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad3b1320c05a5bafe47ad1624f2bd9795',1,'cv::COLOR_LRGB2Luv'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad3b1320c05a5bafe47ad1624f2bd9795',1,'COLOR_LRGB2Luv(Global Namespace)']]], - ['color_5fluv2bgr_967',['COLOR_Luv2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a514896aa2d19659f6a2eca67bb0748f1',1,'cv::COLOR_Luv2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a514896aa2d19659f6a2eca67bb0748f1',1,'COLOR_Luv2BGR(Global Namespace)']]], - ['color_5fluv2lbgr_968',['COLOR_Luv2LBGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acb597d2d413d6d6e8e3d3fb9af456977',1,'cv::COLOR_Luv2LBGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acb597d2d413d6d6e8e3d3fb9af456977',1,'COLOR_Luv2LBGR(Global Namespace)']]], - ['color_5fluv2lrgb_969',['COLOR_Luv2LRGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae92293540e102f1453c1e92a44274eaa',1,'cv::COLOR_Luv2LRGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae92293540e102f1453c1e92a44274eaa',1,'COLOR_Luv2LRGB(Global Namespace)']]], - ['color_5fluv2rgb_970',['COLOR_Luv2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8d68e3f1814d0a649731c0f56835b8c3',1,'cv::COLOR_Luv2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8d68e3f1814d0a649731c0f56835b8c3',1,'COLOR_Luv2RGB(Global Namespace)']]], - ['color_5fmatch_2ehpp_971',['color_match.hpp',['https://docs.opencv.org/4.2.0/da/dc9/color__match_8hpp.html',1,'']]], - ['color_5fmoment_5fhash_2ehpp_972',['color_moment_hash.hpp',['https://docs.opencv.org/4.2.0/d1/d01/color__moment__hash_8hpp.html',1,'']]], - ['color_5fmrgba2rgba_973',['COLOR_mRGBA2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3df7ec7a7d3b2e2334d708355b5ca0f7',1,'cv::COLOR_mRGBA2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3df7ec7a7d3b2e2334d708355b5ca0f7',1,'COLOR_mRGBA2RGBA(Global Namespace)']]], - ['color_5frgb2bgr_974',['COLOR_RGB2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a01a06e50cd3689f5e34e26daf3faaa39',1,'cv::COLOR_RGB2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a01a06e50cd3689f5e34e26daf3faaa39',1,'COLOR_RGB2BGR(Global Namespace)']]], - ['color_5frgb2bgr555_975',['COLOR_RGB2BGR555',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad69f042a9cd91477d6812297d43715dd',1,'cv::COLOR_RGB2BGR555'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad69f042a9cd91477d6812297d43715dd',1,'COLOR_RGB2BGR555(Global Namespace)']]], - ['color_5frgb2bgr565_976',['COLOR_RGB2BGR565',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7f23f766a333054b25188834fc369a76',1,'cv::COLOR_RGB2BGR565'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7f23f766a333054b25188834fc369a76',1,'COLOR_RGB2BGR565(Global Namespace)']]], - ['color_5frgb2bgra_977',['COLOR_RGB2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3b0277b8e071d0f082110e18dfe0fabc',1,'cv::COLOR_RGB2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3b0277b8e071d0f082110e18dfe0fabc',1,'COLOR_RGB2BGRA(Global Namespace)']]], - ['color_5frgb2gray_978',['COLOR_RGB2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae50d0c66ee53e974234ac84cf51d1d4e',1,'cv::COLOR_RGB2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae50d0c66ee53e974234ac84cf51d1d4e',1,'COLOR_RGB2GRAY(Global Namespace)']]], - ['color_5frgb2hls_979',['COLOR_RGB2HLS',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac3d926b985b034433c49fc84de84c85f',1,'cv::COLOR_RGB2HLS'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac3d926b985b034433c49fc84de84c85f',1,'COLOR_RGB2HLS(Global Namespace)']]], - ['color_5frgb2hls_5ffull_980',['COLOR_RGB2HLS_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af331447e78b1e36890985eaf013713b1',1,'cv::COLOR_RGB2HLS_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af331447e78b1e36890985eaf013713b1',1,'COLOR_RGB2HLS_FULL(Global Namespace)']]], - ['color_5frgb2hsv_981',['COLOR_RGB2HSV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa4f6bc658bc546e1660fcab6bf7858f4',1,'cv::COLOR_RGB2HSV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa4f6bc658bc546e1660fcab6bf7858f4',1,'COLOR_RGB2HSV(Global Namespace)']]], - ['color_5frgb2hsv_5ffull_982',['COLOR_RGB2HSV_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae0070d7e97f1e565cc0992d038e5498e',1,'cv::COLOR_RGB2HSV_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae0070d7e97f1e565cc0992d038e5498e',1,'COLOR_RGB2HSV_FULL(Global Namespace)']]], - ['color_5frgb2lab_983',['COLOR_RGB2Lab',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afc25858d4f1127d6051d881d5f4e2b6e',1,'cv::COLOR_RGB2Lab'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afc25858d4f1127d6051d881d5f4e2b6e',1,'COLOR_RGB2Lab(Global Namespace)']]], - ['color_5frgb2luv_984',['COLOR_RGB2Luv',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a5e11d9e294ba89668c080662a8321e45',1,'cv::COLOR_RGB2Luv'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a5e11d9e294ba89668c080662a8321e45',1,'COLOR_RGB2Luv(Global Namespace)']]], - ['color_5frgb2rgba_985',['COLOR_RGB2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0adf2b652f599a5d172d815f849ec35ed5',1,'cv::COLOR_RGB2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0adf2b652f599a5d172d815f849ec35ed5',1,'COLOR_RGB2RGBA(Global Namespace)']]], - ['color_5frgb2xyz_986',['COLOR_RGB2XYZ',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af3894ec8b239815e8a9075099805991a',1,'cv::COLOR_RGB2XYZ'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af3894ec8b239815e8a9075099805991a',1,'COLOR_RGB2XYZ(Global Namespace)']]], - ['color_5frgb2ycrcb_987',['COLOR_RGB2YCrCb',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a56022734d5961924a9e556879f6f05a2',1,'cv::COLOR_RGB2YCrCb'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a56022734d5961924a9e556879f6f05a2',1,'COLOR_RGB2YCrCb(Global Namespace)']]], - ['color_5frgb2yuv_988',['COLOR_RGB2YUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0adc0f8a1354c98d1701caad4b384e0d18',1,'cv::COLOR_RGB2YUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0adc0f8a1354c98d1701caad4b384e0d18',1,'COLOR_RGB2YUV(Global Namespace)']]], - ['color_5frgb2yuv_5fi420_989',['COLOR_RGB2YUV_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8f8a8a89f99c0b9f950a054f5d4eccf8',1,'cv::COLOR_RGB2YUV_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8f8a8a89f99c0b9f950a054f5d4eccf8',1,'COLOR_RGB2YUV_I420(Global Namespace)']]], - ['color_5frgb2yuv_5fiyuv_990',['COLOR_RGB2YUV_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aaddfeb60300f516f4da44f3ea074c84a',1,'cv::COLOR_RGB2YUV_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aaddfeb60300f516f4da44f3ea074c84a',1,'COLOR_RGB2YUV_IYUV(Global Namespace)']]], - ['color_5frgb2yuv_5fyv12_991',['COLOR_RGB2YUV_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0d75409920733f0da9ae46904e0c9c7c',1,'cv::COLOR_RGB2YUV_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0d75409920733f0da9ae46904e0c9c7c',1,'COLOR_RGB2YUV_YV12(Global Namespace)']]], - ['color_5frgba2bgr_992',['COLOR_RGBA2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a03c045af20d58132727be38361297625',1,'cv::COLOR_RGBA2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a03c045af20d58132727be38361297625',1,'COLOR_RGBA2BGR(Global Namespace)']]], - ['color_5frgba2bgr555_993',['COLOR_RGBA2BGR555',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a44141655e91217b5416e3e8be076f3d4',1,'cv::COLOR_RGBA2BGR555'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a44141655e91217b5416e3e8be076f3d4',1,'COLOR_RGBA2BGR555(Global Namespace)']]], - ['color_5frgba2bgr565_994',['COLOR_RGBA2BGR565',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2bdc4a573b742c8c2ba0554287eb8970',1,'cv::COLOR_RGBA2BGR565'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2bdc4a573b742c8c2ba0554287eb8970',1,'COLOR_RGBA2BGR565(Global Namespace)']]], - ['color_5frgba2bgra_995',['COLOR_RGBA2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a488919a903d6434cacc6a47cf058d803',1,'cv::COLOR_RGBA2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a488919a903d6434cacc6a47cf058d803',1,'COLOR_RGBA2BGRA(Global Namespace)']]], - ['color_5frgba2gray_996',['COLOR_RGBA2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a85254b7acc2eb0171639906911f612e8',1,'cv::COLOR_RGBA2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a85254b7acc2eb0171639906911f612e8',1,'COLOR_RGBA2GRAY(Global Namespace)']]], - ['color_5frgba2mrgba_997',['COLOR_RGBA2mRGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8ce54170c486e2deddac3aff035f4af7',1,'cv::COLOR_RGBA2mRGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8ce54170c486e2deddac3aff035f4af7',1,'COLOR_RGBA2mRGBA(Global Namespace)']]], - ['color_5frgba2rgb_998',['COLOR_RGBA2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a6a41529c15d9874918d2b312a7d3f138',1,'cv::COLOR_RGBA2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a6a41529c15d9874918d2b312a7d3f138',1,'COLOR_RGBA2RGB(Global Namespace)']]], - ['color_5frgba2yuv_5fi420_999',['COLOR_RGBA2YUV_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abe780d95b79398395c219742a7f3a6c0',1,'cv::COLOR_RGBA2YUV_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abe780d95b79398395c219742a7f3a6c0',1,'COLOR_RGBA2YUV_I420(Global Namespace)']]], - ['color_5frgba2yuv_5fiyuv_1000',['COLOR_RGBA2YUV_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa3d872ebd8d2c7bc99b58ac56f7cb68a',1,'cv::COLOR_RGBA2YUV_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa3d872ebd8d2c7bc99b58ac56f7cb68a',1,'COLOR_RGBA2YUV_IYUV(Global Namespace)']]], - ['color_5frgba2yuv_5fyv12_1001',['COLOR_RGBA2YUV_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a9d7c47d20a3bb71640ad35eb9275e094',1,'cv::COLOR_RGBA2YUV_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a9d7c47d20a3bb71640ad35eb9275e094',1,'COLOR_RGBA2YUV_YV12(Global Namespace)']]], - ['color_5fxyz2bgr_1002',['COLOR_XYZ2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa4d7480cfca520a55ae13ff0c5268796',1,'cv::COLOR_XYZ2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa4d7480cfca520a55ae13ff0c5268796',1,'COLOR_XYZ2BGR(Global Namespace)']]], - ['color_5fxyz2rgb_1003',['COLOR_XYZ2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a95815945a63cc47ce9237654857f231e',1,'cv::COLOR_XYZ2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a95815945a63cc47ce9237654857f231e',1,'COLOR_XYZ2RGB(Global Namespace)']]], - ['color_5fycrcb2bgr_1004',['COLOR_YCrCb2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa6d4108b0f3d5e21dc246a0c59592b38',1,'cv::COLOR_YCrCb2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa6d4108b0f3d5e21dc246a0c59592b38',1,'COLOR_YCrCb2BGR(Global Namespace)']]], - ['color_5fycrcb2rgb_1005',['COLOR_YCrCb2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a27b56972a73ad4f2660512ac1cca552d',1,'cv::COLOR_YCrCb2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a27b56972a73ad4f2660512ac1cca552d',1,'COLOR_YCrCb2RGB(Global Namespace)']]], - ['color_5fyuv2bgr_1006',['COLOR_YUV2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab053f0cf23ae1b0bfee1964fd9a182c9',1,'cv::COLOR_YUV2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab053f0cf23ae1b0bfee1964fd9a182c9',1,'COLOR_YUV2BGR(Global Namespace)']]], - ['color_5fyuv2bgr_5fi420_1007',['COLOR_YUV2BGR_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a305e5da3816c78b3d1ffa0498424e94f',1,'cv::COLOR_YUV2BGR_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a305e5da3816c78b3d1ffa0498424e94f',1,'COLOR_YUV2BGR_I420(Global Namespace)']]], - ['color_5fyuv2bgr_5fiyuv_1008',['COLOR_YUV2BGR_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af60dd40f7223d5409bc9abb84d6f2970',1,'cv::COLOR_YUV2BGR_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af60dd40f7223d5409bc9abb84d6f2970',1,'COLOR_YUV2BGR_IYUV(Global Namespace)']]], - ['color_5fyuv2bgr_5fnv12_1009',['COLOR_YUV2BGR_NV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3e07baa107cda0b6756eb112fb5c3f4e',1,'cv::COLOR_YUV2BGR_NV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3e07baa107cda0b6756eb112fb5c3f4e',1,'COLOR_YUV2BGR_NV12(Global Namespace)']]], - ['color_5fyuv2bgr_5fnv21_1010',['COLOR_YUV2BGR_NV21',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa8a2838076779f05746a7649319be286',1,'cv::COLOR_YUV2BGR_NV21'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa8a2838076779f05746a7649319be286',1,'COLOR_YUV2BGR_NV21(Global Namespace)']]], - ['color_5fyuv2bgr_5fuynv_1011',['COLOR_YUV2BGR_UYNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abaf5dcb244262bee65b837b37ac8e8a2',1,'cv::COLOR_YUV2BGR_UYNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abaf5dcb244262bee65b837b37ac8e8a2',1,'COLOR_YUV2BGR_UYNV(Global Namespace)']]], - ['color_5fyuv2bgr_5fuyvy_1012',['COLOR_YUV2BGR_UYVY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae8538a74bb0f8c3dd5b11a6f32e5911d',1,'cv::COLOR_YUV2BGR_UYVY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae8538a74bb0f8c3dd5b11a6f32e5911d',1,'COLOR_YUV2BGR_UYVY(Global Namespace)']]], - ['color_5fyuv2bgr_5fy422_1013',['COLOR_YUV2BGR_Y422',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afe8ad387e079dba85956e79930d782af',1,'cv::COLOR_YUV2BGR_Y422'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afe8ad387e079dba85956e79930d782af',1,'COLOR_YUV2BGR_Y422(Global Namespace)']]], - ['color_5fyuv2bgr_5fyunv_1014',['COLOR_YUV2BGR_YUNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4f49f8807de295e1b8cbfdac9c914d71',1,'cv::COLOR_YUV2BGR_YUNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4f49f8807de295e1b8cbfdac9c914d71',1,'COLOR_YUV2BGR_YUNV(Global Namespace)']]], - ['color_5fyuv2bgr_5fyuy2_1015',['COLOR_YUV2BGR_YUY2',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a262578eae5d795e1e00b4d50be95156a',1,'cv::COLOR_YUV2BGR_YUY2'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a262578eae5d795e1e00b4d50be95156a',1,'COLOR_YUV2BGR_YUY2(Global Namespace)']]], - ['color_5fyuv2bgr_5fyuyv_1016',['COLOR_YUV2BGR_YUYV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2b1df3d7a0714c9bfefd80e2aad75c2c',1,'cv::COLOR_YUV2BGR_YUYV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2b1df3d7a0714c9bfefd80e2aad75c2c',1,'COLOR_YUV2BGR_YUYV(Global Namespace)']]], - ['color_5fyuv2bgr_5fyv12_1017',['COLOR_YUV2BGR_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a92235c803c5adda43042be73d4987137',1,'cv::COLOR_YUV2BGR_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a92235c803c5adda43042be73d4987137',1,'COLOR_YUV2BGR_YV12(Global Namespace)']]], - ['color_5fyuv2bgr_5fyvyu_1018',['COLOR_YUV2BGR_YVYU',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a89cb4aa303651e036048e1b21dd1f3d6',1,'cv::COLOR_YUV2BGR_YVYU'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a89cb4aa303651e036048e1b21dd1f3d6',1,'COLOR_YUV2BGR_YVYU(Global Namespace)']]], - ['color_5fyuv2bgra_5fi420_1019',['COLOR_YUV2BGRA_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0ffa81c19231ddd2e9cee8616a3a4673',1,'cv::COLOR_YUV2BGRA_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0ffa81c19231ddd2e9cee8616a3a4673',1,'COLOR_YUV2BGRA_I420(Global Namespace)']]], - ['color_5fyuv2bgra_5fiyuv_1020',['COLOR_YUV2BGRA_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a6417b107bad4465639435dd4ca8c90bf',1,'cv::COLOR_YUV2BGRA_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a6417b107bad4465639435dd4ca8c90bf',1,'COLOR_YUV2BGRA_IYUV(Global Namespace)']]], - ['color_5fyuv2bgra_5fnv12_1021',['COLOR_YUV2BGRA_NV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af7b3bf5d87c6e0174b9cb7694dd37c7b',1,'cv::COLOR_YUV2BGRA_NV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af7b3bf5d87c6e0174b9cb7694dd37c7b',1,'COLOR_YUV2BGRA_NV12(Global Namespace)']]], - ['color_5fyuv2bgra_5fnv21_1022',['COLOR_YUV2BGRA_NV21',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac21e90d9ba13a67d2a08fedc3c756708',1,'cv::COLOR_YUV2BGRA_NV21'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac21e90d9ba13a67d2a08fedc3c756708',1,'COLOR_YUV2BGRA_NV21(Global Namespace)']]], - ['color_5fyuv2bgra_5fuynv_1023',['COLOR_YUV2BGRA_UYNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4fc66a57ff5b814a23de5b97d97d37e8',1,'cv::COLOR_YUV2BGRA_UYNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4fc66a57ff5b814a23de5b97d97d37e8',1,'COLOR_YUV2BGRA_UYNV(Global Namespace)']]], - ['color_5fyuv2bgra_5fuyvy_1024',['COLOR_YUV2BGRA_UYVY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a464e09aadb40edf8fa9385d7a59c2803',1,'cv::COLOR_YUV2BGRA_UYVY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a464e09aadb40edf8fa9385d7a59c2803',1,'COLOR_YUV2BGRA_UYVY(Global Namespace)']]], - ['color_5fyuv2bgra_5fy422_1025',['COLOR_YUV2BGRA_Y422',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a631d75dcef319bce60e5703c44ab6a1f',1,'cv::COLOR_YUV2BGRA_Y422'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a631d75dcef319bce60e5703c44ab6a1f',1,'COLOR_YUV2BGRA_Y422(Global Namespace)']]], - ['color_5fyuv2bgra_5fyunv_1026',['COLOR_YUV2BGRA_YUNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0a7cf70088adfe277113bdc2bcf51029',1,'cv::COLOR_YUV2BGRA_YUNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0a7cf70088adfe277113bdc2bcf51029',1,'COLOR_YUV2BGRA_YUNV(Global Namespace)']]], - ['color_5fyuv2bgra_5fyuy2_1027',['COLOR_YUV2BGRA_YUY2',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aefbb246de87843ee087b55aa078a8c2b',1,'cv::COLOR_YUV2BGRA_YUY2'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aefbb246de87843ee087b55aa078a8c2b',1,'COLOR_YUV2BGRA_YUY2(Global Namespace)']]], - ['color_5fyuv2bgra_5fyuyv_1028',['COLOR_YUV2BGRA_YUYV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0968d9a3aa7ab48d3ddd5c1b9f526e8c',1,'cv::COLOR_YUV2BGRA_YUYV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0968d9a3aa7ab48d3ddd5c1b9f526e8c',1,'COLOR_YUV2BGRA_YUYV(Global Namespace)']]], - ['color_5fyuv2bgra_5fyv12_1029',['COLOR_YUV2BGRA_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a74d7d6d93ff31f5ed80161727b8e608d',1,'cv::COLOR_YUV2BGRA_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a74d7d6d93ff31f5ed80161727b8e608d',1,'COLOR_YUV2BGRA_YV12(Global Namespace)']]], - ['color_5fyuv2bgra_5fyvyu_1030',['COLOR_YUV2BGRA_YVYU',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a88ae64bdb5e399911e53caa809ab4df6',1,'cv::COLOR_YUV2BGRA_YVYU'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a88ae64bdb5e399911e53caa809ab4df6',1,'COLOR_YUV2BGRA_YVYU(Global Namespace)']]], - ['color_5fyuv2gray_5f420_1031',['COLOR_YUV2GRAY_420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac04bb1de2f067221ccf4659c8a4be4ea',1,'cv::COLOR_YUV2GRAY_420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac04bb1de2f067221ccf4659c8a4be4ea',1,'COLOR_YUV2GRAY_420(Global Namespace)']]], - ['color_5fyuv2gray_5fi420_1032',['COLOR_YUV2GRAY_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3bf49e55a5d764487966f03b80a09290',1,'cv::COLOR_YUV2GRAY_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3bf49e55a5d764487966f03b80a09290',1,'COLOR_YUV2GRAY_I420(Global Namespace)']]], - ['color_5fyuv2gray_5fiyuv_1033',['COLOR_YUV2GRAY_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aba65ee89da14eaa6222ed0acdb1078cd',1,'cv::COLOR_YUV2GRAY_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aba65ee89da14eaa6222ed0acdb1078cd',1,'COLOR_YUV2GRAY_IYUV(Global Namespace)']]], - ['color_5fyuv2gray_5fnv12_1034',['COLOR_YUV2GRAY_NV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac5c033333be1929eaea9da93b7008e20',1,'cv::COLOR_YUV2GRAY_NV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac5c033333be1929eaea9da93b7008e20',1,'COLOR_YUV2GRAY_NV12(Global Namespace)']]], - ['color_5fyuv2gray_5fnv21_1035',['COLOR_YUV2GRAY_NV21',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1cba7092b4f0302693526ca578159ea0',1,'cv::COLOR_YUV2GRAY_NV21'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1cba7092b4f0302693526ca578159ea0',1,'COLOR_YUV2GRAY_NV21(Global Namespace)']]], - ['color_5fyuv2gray_5fuynv_1036',['COLOR_YUV2GRAY_UYNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1015db548386c49010a90d41f90fd11d',1,'cv::COLOR_YUV2GRAY_UYNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1015db548386c49010a90d41f90fd11d',1,'COLOR_YUV2GRAY_UYNV(Global Namespace)']]], - ['color_5fyuv2gray_5fuyvy_1037',['COLOR_YUV2GRAY_UYVY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab4a49ff92449a5587639bdd6ab098d5a',1,'cv::COLOR_YUV2GRAY_UYVY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab4a49ff92449a5587639bdd6ab098d5a',1,'COLOR_YUV2GRAY_UYVY(Global Namespace)']]], - ['color_5fyuv2gray_5fy422_1038',['COLOR_YUV2GRAY_Y422',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1ff10701b9d77e85ba2454172b4e5712',1,'cv::COLOR_YUV2GRAY_Y422'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1ff10701b9d77e85ba2454172b4e5712',1,'COLOR_YUV2GRAY_Y422(Global Namespace)']]], - ['color_5fyuv2gray_5fyunv_1039',['COLOR_YUV2GRAY_YUNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abb11c6daa922c7c9fa6b6c8d474c78a6',1,'cv::COLOR_YUV2GRAY_YUNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abb11c6daa922c7c9fa6b6c8d474c78a6',1,'COLOR_YUV2GRAY_YUNV(Global Namespace)']]], - ['color_5fyuv2gray_5fyuy2_1040',['COLOR_YUV2GRAY_YUY2',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3df6e6d6a38058a5b477c48b7fa519c8',1,'cv::COLOR_YUV2GRAY_YUY2'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3df6e6d6a38058a5b477c48b7fa519c8',1,'COLOR_YUV2GRAY_YUY2(Global Namespace)']]], - ['color_5fyuv2gray_5fyuyv_1041',['COLOR_YUV2GRAY_YUYV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0655ee55d0a0379b100832d01cc3069e',1,'cv::COLOR_YUV2GRAY_YUYV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0655ee55d0a0379b100832d01cc3069e',1,'COLOR_YUV2GRAY_YUYV(Global Namespace)']]], - ['color_5fyuv2gray_5fyv12_1042',['COLOR_YUV2GRAY_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a706e646e6be8567bfda6d0a2ea15a1b1',1,'cv::COLOR_YUV2GRAY_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a706e646e6be8567bfda6d0a2ea15a1b1',1,'COLOR_YUV2GRAY_YV12(Global Namespace)']]], - ['color_5fyuv2gray_5fyvyu_1043',['COLOR_YUV2GRAY_YVYU',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a89fd5683a25e142cb2c29acab04dc4c9',1,'cv::COLOR_YUV2GRAY_YVYU'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a89fd5683a25e142cb2c29acab04dc4c9',1,'COLOR_YUV2GRAY_YVYU(Global Namespace)']]], - ['color_5fyuv2rgb_1044',['COLOR_YUV2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab09d8186a9e5aaac83acd157a1be43b0',1,'cv::COLOR_YUV2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab09d8186a9e5aaac83acd157a1be43b0',1,'COLOR_YUV2RGB(Global Namespace)']]], - ['color_5fyuv2rgb_5fi420_1045',['COLOR_YUV2RGB_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a35687717fabb536c1e1ec0857714aaf9',1,'cv::COLOR_YUV2RGB_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a35687717fabb536c1e1ec0857714aaf9',1,'COLOR_YUV2RGB_I420(Global Namespace)']]], - ['color_5fyuv2rgb_5fiyuv_1046',['COLOR_YUV2RGB_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8673261b10ad0a1a7b1ff19dbd7bc818',1,'cv::COLOR_YUV2RGB_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8673261b10ad0a1a7b1ff19dbd7bc818',1,'COLOR_YUV2RGB_IYUV(Global Namespace)']]], - ['color_5fyuv2rgb_5fnv12_1047',['COLOR_YUV2RGB_NV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a86027a131a58ef888873fafd4eb603d0',1,'cv::COLOR_YUV2RGB_NV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a86027a131a58ef888873fafd4eb603d0',1,'COLOR_YUV2RGB_NV12(Global Namespace)']]], - ['color_5fyuv2rgb_5fnv21_1048',['COLOR_YUV2RGB_NV21',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a32167a86e9b39dbcba4c67a9413cf1a7',1,'cv::COLOR_YUV2RGB_NV21'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a32167a86e9b39dbcba4c67a9413cf1a7',1,'COLOR_YUV2RGB_NV21(Global Namespace)']]], - ['color_5fyuv2rgb_5fuynv_1049',['COLOR_YUV2RGB_UYNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a30c182e297e92cccca92300d3c3df3e4',1,'cv::COLOR_YUV2RGB_UYNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a30c182e297e92cccca92300d3c3df3e4',1,'COLOR_YUV2RGB_UYNV(Global Namespace)']]], - ['color_5fyuv2rgb_5fuyvy_1050',['COLOR_YUV2RGB_UYVY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a59161264b3a52d23b677fd495cc56abc',1,'cv::COLOR_YUV2RGB_UYVY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a59161264b3a52d23b677fd495cc56abc',1,'COLOR_YUV2RGB_UYVY(Global Namespace)']]], - ['color_5fyuv2rgb_5fy422_1051',['COLOR_YUV2RGB_Y422',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0adec44ab1f36e17aad9907c99f277562b',1,'cv::COLOR_YUV2RGB_Y422'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0adec44ab1f36e17aad9907c99f277562b',1,'COLOR_YUV2RGB_Y422(Global Namespace)']]], - ['color_5fyuv2rgb_5fyunv_1052',['COLOR_YUV2RGB_YUNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a02c191ee6abdf1c06cc95225f1169dbd',1,'cv::COLOR_YUV2RGB_YUNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a02c191ee6abdf1c06cc95225f1169dbd',1,'COLOR_YUV2RGB_YUNV(Global Namespace)']]], - ['color_5fyuv2rgb_5fyuy2_1053',['COLOR_YUV2RGB_YUY2',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7543b3884ee368db305c8e43da00ca3e',1,'cv::COLOR_YUV2RGB_YUY2'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7543b3884ee368db305c8e43da00ca3e',1,'COLOR_YUV2RGB_YUY2(Global Namespace)']]], - ['color_5fyuv2rgb_5fyuyv_1054',['COLOR_YUV2RGB_YUYV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a816129bdd294a57642d1428f26ba611b',1,'cv::COLOR_YUV2RGB_YUYV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a816129bdd294a57642d1428f26ba611b',1,'COLOR_YUV2RGB_YUYV(Global Namespace)']]], - ['color_5fyuv2rgb_5fyv12_1055',['COLOR_YUV2RGB_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a55cc4531c9aac17e0a8e7dbf222fffe2',1,'cv::COLOR_YUV2RGB_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a55cc4531c9aac17e0a8e7dbf222fffe2',1,'COLOR_YUV2RGB_YV12(Global Namespace)']]], - ['color_5fyuv2rgb_5fyvyu_1056',['COLOR_YUV2RGB_YVYU',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa03abded4be87e3c67170203f4fb1fb0',1,'cv::COLOR_YUV2RGB_YVYU'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa03abded4be87e3c67170203f4fb1fb0',1,'COLOR_YUV2RGB_YVYU(Global Namespace)']]], - ['color_5fyuv2rgba_5fi420_1057',['COLOR_YUV2RGBA_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a18346327c937bca2aa2856914ff11507',1,'cv::COLOR_YUV2RGBA_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a18346327c937bca2aa2856914ff11507',1,'COLOR_YUV2RGBA_I420(Global Namespace)']]], - ['color_5fyuv2rgba_5fiyuv_1058',['COLOR_YUV2RGBA_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a616b629a231a86ff57deca4ab2451972',1,'cv::COLOR_YUV2RGBA_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a616b629a231a86ff57deca4ab2451972',1,'COLOR_YUV2RGBA_IYUV(Global Namespace)']]], - ['color_5fyuv2rgba_5fnv12_1059',['COLOR_YUV2RGBA_NV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aaa0df213a6548ebef3469f78d4e5d842',1,'cv::COLOR_YUV2RGBA_NV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aaa0df213a6548ebef3469f78d4e5d842',1,'COLOR_YUV2RGBA_NV12(Global Namespace)']]], - ['color_5fyuv2rgba_5fnv21_1060',['COLOR_YUV2RGBA_NV21',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3816bd6f95595fe01c7c488a0b411939',1,'cv::COLOR_YUV2RGBA_NV21'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3816bd6f95595fe01c7c488a0b411939',1,'COLOR_YUV2RGBA_NV21(Global Namespace)']]], - ['color_5fyuv2rgba_5fuynv_1061',['COLOR_YUV2RGBA_UYNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a78ee01c55618829bcf63e80add4ba702',1,'cv::COLOR_YUV2RGBA_UYNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a78ee01c55618829bcf63e80add4ba702',1,'COLOR_YUV2RGBA_UYNV(Global Namespace)']]], - ['color_5fyuv2rgba_5fuyvy_1062',['COLOR_YUV2RGBA_UYVY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a82fe41ee206c9d3ee78bce75d1fcf2de',1,'cv::COLOR_YUV2RGBA_UYVY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a82fe41ee206c9d3ee78bce75d1fcf2de',1,'COLOR_YUV2RGBA_UYVY(Global Namespace)']]], - ['color_5fyuv2rgba_5fy422_1063',['COLOR_YUV2RGBA_Y422',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a736392e7b201d7cfce88e051fc5addb1',1,'cv::COLOR_YUV2RGBA_Y422'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a736392e7b201d7cfce88e051fc5addb1',1,'COLOR_YUV2RGBA_Y422(Global Namespace)']]], - ['color_5fyuv2rgba_5fyunv_1064',['COLOR_YUV2RGBA_YUNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8f49b5b3a04d065814bd1dade3494d99',1,'cv::COLOR_YUV2RGBA_YUNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8f49b5b3a04d065814bd1dade3494d99',1,'COLOR_YUV2RGBA_YUNV(Global Namespace)']]], - ['color_5fyuv2rgba_5fyuy2_1065',['COLOR_YUV2RGBA_YUY2',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af31f4e5b4f6dc223d87115918779f0ad',1,'cv::COLOR_YUV2RGBA_YUY2'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af31f4e5b4f6dc223d87115918779f0ad',1,'COLOR_YUV2RGBA_YUY2(Global Namespace)']]], - ['color_5fyuv2rgba_5fyuyv_1066',['COLOR_YUV2RGBA_YUYV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a20dc8999c02e700ea548bf6b5926e2b5',1,'cv::COLOR_YUV2RGBA_YUYV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a20dc8999c02e700ea548bf6b5926e2b5',1,'COLOR_YUV2RGBA_YUYV(Global Namespace)']]], - ['color_5fyuv2rgba_5fyv12_1067',['COLOR_YUV2RGBA_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab454d840f4d6f682538d3eac06ace494',1,'cv::COLOR_YUV2RGBA_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab454d840f4d6f682538d3eac06ace494',1,'COLOR_YUV2RGBA_YV12(Global Namespace)']]], - ['color_5fyuv2rgba_5fyvyu_1068',['COLOR_YUV2RGBA_YVYU',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a09d8ecbc19025a376a5173f8d5b888a3',1,'cv::COLOR_YUV2RGBA_YVYU'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a09d8ecbc19025a376a5173f8d5b888a3',1,'COLOR_YUV2RGBA_YVYU(Global Namespace)']]], - ['color_5fyuv420p2bgr_1069',['COLOR_YUV420p2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0609f45b27b113b6faf342e95fbc7bfb',1,'cv::COLOR_YUV420p2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0609f45b27b113b6faf342e95fbc7bfb',1,'COLOR_YUV420p2BGR(Global Namespace)']]], - ['color_5fyuv420p2bgra_1070',['COLOR_YUV420p2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a201fb31ede4712386f6b1c04299f0e3d',1,'cv::COLOR_YUV420p2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a201fb31ede4712386f6b1c04299f0e3d',1,'COLOR_YUV420p2BGRA(Global Namespace)']]], - ['color_5fyuv420p2gray_1071',['COLOR_YUV420p2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a6d90778212c0069b195ed94bf7db23ee',1,'cv::COLOR_YUV420p2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a6d90778212c0069b195ed94bf7db23ee',1,'COLOR_YUV420p2GRAY(Global Namespace)']]], - ['color_5fyuv420p2rgb_1072',['COLOR_YUV420p2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afbccef9d394822d30408994976e594c9',1,'cv::COLOR_YUV420p2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afbccef9d394822d30408994976e594c9',1,'COLOR_YUV420p2RGB(Global Namespace)']]], - ['color_5fyuv420p2rgba_1073',['COLOR_YUV420p2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aface8da7f925912e04a3cec8377754e4',1,'cv::COLOR_YUV420p2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aface8da7f925912e04a3cec8377754e4',1,'COLOR_YUV420p2RGBA(Global Namespace)']]], - ['color_5fyuv420sp2bgr_1074',['COLOR_YUV420sp2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ada5e32ef7600f3786731d4d0e3128194',1,'cv::COLOR_YUV420sp2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ada5e32ef7600f3786731d4d0e3128194',1,'COLOR_YUV420sp2BGR(Global Namespace)']]], - ['color_5fyuv420sp2bgra_1075',['COLOR_YUV420sp2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4356f38558b9ec0c2522142833116507',1,'cv::COLOR_YUV420sp2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4356f38558b9ec0c2522142833116507',1,'COLOR_YUV420sp2BGRA(Global Namespace)']]], - ['color_5fyuv420sp2gray_1076',['COLOR_YUV420sp2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad67afc6fc415586e101b2881f73a2eff',1,'cv::COLOR_YUV420sp2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad67afc6fc415586e101b2881f73a2eff',1,'COLOR_YUV420sp2GRAY(Global Namespace)']]], - ['color_5fyuv420sp2rgb_1077',['COLOR_YUV420sp2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0c598794f13df7b2e48cfc77a65bf0f6',1,'cv::COLOR_YUV420sp2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0c598794f13df7b2e48cfc77a65bf0f6',1,'COLOR_YUV420sp2RGB(Global Namespace)']]], - ['color_5fyuv420sp2rgba_1078',['COLOR_YUV420sp2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7490daf39c58de9be425f33714d92e7b',1,'cv::COLOR_YUV420sp2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7490daf39c58de9be425f33714d92e7b',1,'COLOR_YUV420sp2RGBA(Global Namespace)']]], - ['coloraverageinpainter_1079',['ColorAverageInpainter',['https://docs.opencv.org/4.2.0/d1/dc6/classcv_1_1videostab_1_1ColorAverageInpainter.html',1,'cv::videostab']]], - ['colorchange_1080',['colorChange',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#ga6684f35dc669ff6196a7c340dc73b98e',1,'cv::colorChange()'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#ga6684f35dc669ff6196a7c340dc73b98e',1,'colorChange()(Global Namespace)']]], - ['colorconversioncodes_1081',['ColorConversionCodes',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga4e0972be5de079fed4e3a10e24ef5ef0',1,'cv::ColorConversionCodes'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga4e0972be5de079fed4e3a10e24ef5ef0',1,'ColorConversionCodes(Global Namespace)']]], - ['colorgradient_1082',['ColorGradient',['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html',1,'cv::linemod::ColorGradient'],['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a95a30b50bb3ee9788171a9aca7e49e01',1,'cv::linemod::ColorGradient::ColorGradient()'],['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#ab7fa732bb8f0c1079ae60d28eea8c8d9',1,'cv::linemod::ColorGradient::ColorGradient(float weak_threshold, size_t num_features, float strong_threshold)']]], - ['colorinpainter_1083',['ColorInpainter',['https://docs.opencv.org/4.2.0/d3/d2b/classcv_1_1videostab_1_1ColorInpainter.html',1,'cv::videostab::ColorInpainter'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga23ab7e15cf5caaf624a90607d863c07e',1,'cv::videostab::ColorInpainter::ColorInpainter()'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga23ab7e15cf5caaf624a90607d863c07e',1,'ColorInpainter()(Global Namespace)']]], - ['colormap_1084',['colormap',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaa6148fb2b9582f983782fdc89afe3384',1,'cv::linemod::colormap()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaa6148fb2b9582f983782fdc89afe3384',1,'colormap()(Global Namespace)']]], - ['colormap_5fautumn_1085',['COLORMAP_AUTUMN',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a5d4a709cda1130bfa3cc4b4c5ae8f82a',1,'cv::COLORMAP_AUTUMN'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a5d4a709cda1130bfa3cc4b4c5ae8f82a',1,'COLORMAP_AUTUMN(Global Namespace)']]], - ['colormap_5fbone_1086',['COLORMAP_BONE',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a91d58e66f015ea030150bdc8545d3b41',1,'cv::COLORMAP_BONE'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a91d58e66f015ea030150bdc8545d3b41',1,'COLORMAP_BONE(Global Namespace)']]], - ['colormap_5fcividis_1087',['COLORMAP_CIVIDIS',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a9742bb11678692f9ba22c7c0c0fa1abd',1,'cv::COLORMAP_CIVIDIS'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a9742bb11678692f9ba22c7c0c0fa1abd',1,'COLORMAP_CIVIDIS(Global Namespace)']]], - ['colormap_5fcool_1088',['COLORMAP_COOL',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a16c23a6bf984dc0f7a9704bd16fd6917',1,'cv::COLORMAP_COOL'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a16c23a6bf984dc0f7a9704bd16fd6917',1,'COLORMAP_COOL(Global Namespace)']]], - ['colormap_5fhot_1089',['COLORMAP_HOT',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65aef83628a5b46e23bf823000ff0270304',1,'cv::COLORMAP_HOT'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65aef83628a5b46e23bf823000ff0270304',1,'COLORMAP_HOT(Global Namespace)']]], - ['colormap_5fhsv_1090',['COLORMAP_HSV',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a141ad9bfece7aa670ff3bddd38fac98e',1,'cv::COLORMAP_HSV'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a141ad9bfece7aa670ff3bddd38fac98e',1,'COLORMAP_HSV(Global Namespace)']]], - ['colormap_5finferno_1091',['COLORMAP_INFERNO',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ab5e0464f3ac7083a8f030a45f24005fa',1,'cv::COLORMAP_INFERNO'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ab5e0464f3ac7083a8f030a45f24005fa',1,'COLORMAP_INFERNO(Global Namespace)']]], - ['colormap_5fjet_1092',['COLORMAP_JET',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ab3f207661ddf74511b002b1acda5ec09',1,'cv::COLORMAP_JET'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ab3f207661ddf74511b002b1acda5ec09',1,'COLORMAP_JET(Global Namespace)']]], - ['colormap_5fmagma_1093',['COLORMAP_MAGMA',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ad4b00db72c380f9227c3f48b32121eb7',1,'cv::COLORMAP_MAGMA'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ad4b00db72c380f9227c3f48b32121eb7',1,'COLORMAP_MAGMA(Global Namespace)']]], - ['colormap_5focean_1094',['COLORMAP_OCEAN',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a8c4210cb135b2555ba95e2db97f65ace',1,'cv::COLORMAP_OCEAN'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a8c4210cb135b2555ba95e2db97f65ace',1,'COLORMAP_OCEAN(Global Namespace)']]], - ['colormap_5fparula_1095',['COLORMAP_PARULA',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a48cbda63f52a232eea096a54f2a7572d',1,'cv::COLORMAP_PARULA'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a48cbda63f52a232eea096a54f2a7572d',1,'COLORMAP_PARULA(Global Namespace)']]], - ['colormap_5fpink_1096',['COLORMAP_PINK',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a84213aa42eaa8fcadacde9fc33a4d88b',1,'cv::COLORMAP_PINK'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a84213aa42eaa8fcadacde9fc33a4d88b',1,'COLORMAP_PINK(Global Namespace)']]], - ['colormap_5fplasma_1097',['COLORMAP_PLASMA',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a732a833f9939122143cfb7772cabd10d',1,'cv::COLORMAP_PLASMA'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a732a833f9939122143cfb7772cabd10d',1,'COLORMAP_PLASMA(Global Namespace)']]], - ['colormap_5frainbow_1098',['COLORMAP_RAINBOW',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65af7f0add024009b0e43f8c83f3ca0b923',1,'cv::COLORMAP_RAINBOW'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65af7f0add024009b0e43f8c83f3ca0b923',1,'COLORMAP_RAINBOW(Global Namespace)']]], - ['colormap_5fspring_1099',['COLORMAP_SPRING',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65afde88b0caed8acc01447906d700b99fb',1,'cv::COLORMAP_SPRING'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65afde88b0caed8acc01447906d700b99fb',1,'COLORMAP_SPRING(Global Namespace)']]], - ['colormap_5fsummer_1100',['COLORMAP_SUMMER',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a5e032add919a3c2c447182f0815d2a6f',1,'cv::COLORMAP_SUMMER'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a5e032add919a3c2c447182f0815d2a6f',1,'COLORMAP_SUMMER(Global Namespace)']]], - ['colormap_5fturbo_1101',['COLORMAP_TURBO',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a61e4747e35b5775ea2ca27ac1484ad94',1,'cv::COLORMAP_TURBO'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a61e4747e35b5775ea2ca27ac1484ad94',1,'COLORMAP_TURBO(Global Namespace)']]], - ['colormap_5ftwilight_1102',['COLORMAP_TWILIGHT',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a2785d360bb7875d9a7127b3a7304f688',1,'cv::COLORMAP_TWILIGHT'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a2785d360bb7875d9a7127b3a7304f688',1,'COLORMAP_TWILIGHT(Global Namespace)']]], - ['colormap_5ftwilight_5fshifted_1103',['COLORMAP_TWILIGHT_SHIFTED',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ae0deafa5ab38bd25d34b620c1778e52c',1,'cv::COLORMAP_TWILIGHT_SHIFTED'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ae0deafa5ab38bd25d34b620c1778e52c',1,'COLORMAP_TWILIGHT_SHIFTED(Global Namespace)']]], - ['colormap_5fviridis_1104',['COLORMAP_VIRIDIS',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65afdb81862da35ea4912a75f0e8f274aeb',1,'cv::COLORMAP_VIRIDIS'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65afdb81862da35ea4912a75f0e8f274aeb',1,'COLORMAP_VIRIDIS(Global Namespace)']]], - ['colormap_5fwinter_1105',['COLORMAP_WINTER',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a66b53e69b9d61792e57008962dbef670',1,'cv::COLORMAP_WINTER'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a66b53e69b9d61792e57008962dbef670',1,'COLORMAP_WINTER(Global Namespace)']]], - ['colormaps_20in_20opencv_1106',['ColorMaps in OpenCV',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html',1,'']]], - ['colormaptypes_1107',['ColormapTypes',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#ga9a805d8262bcbe273f16be9ea2055a65',1,'cv::ColormapTypes'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#ga9a805d8262bcbe273f16be9ea2055a65',1,'ColormapTypes(Global Namespace)']]], - ['colormatchtemplate_1108',['colorMatchTemplate',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga370f180e4a52231ba218adbb4a65a9ca',1,'cv::ximgproc::colorMatchTemplate()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga370f180e4a52231ba218adbb4a65a9ca',1,'colorMatchTemplate()(Global Namespace)']]], - ['colormode_1109',['colorMode',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#ae9360e586da9c97389a18d4896efd7ae',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], - ['colormomenthash_1110',['ColorMomentHash',['https://docs.opencv.org/4.2.0/df/d52/classcv_1_1img__hash_1_1ColorMomentHash.html',1,'cv::img_hash::ColorMomentHash'],['https://docs.opencv.org/4.2.0/df/d52/classcv_1_1img__hash_1_1ColorMomentHash.html#a5f541f69c95426c6f220fef2f88d47c5',1,'cv::img_hash::ColorMomentHash::ColorMomentHash()']]], - ['colormomenthash_1111',['colorMomentHash',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gac2b55a4cec31a709cee9f9cdd6b933f7',1,'cv::img_hash::colorMomentHash()'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gac2b55a4cec31a709cee9f9cdd6b933f7',1,'colorMomentHash()(Global Namespace)']]], - ['colors_1112',['colors',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a836d38fde4eb6f42ebfa9b1772d96ffe',1,'cv::viz::Mesh::colors'],['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html#a283a848fc7f6f246b5544bfc7e59c151',1,'cv::MultiTracker_Alt::colors']]], - ['colors_2emarkdown_1113',['colors.markdown',['https://docs.opencv.org/4.2.0/db/d92/colors_8markdown.html',1,'']]], - ['colorspace_5fbgr_1114',['COLORSPACE_BGR',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a8beca7fd4c27aed0d4ccfbfea567b094adde600835a7bb93f9ccc4ddeb806f487',1,'cv']]], - ['colorspace_5fgray_1115',['COLORSPACE_GRAY',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a8beca7fd4c27aed0d4ccfbfea567b094a45a2bba39a5ffe951554d85c20cac692',1,'cv']]], - ['colorspace_5frgba_1116',['COLORSPACE_RGBA',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a8beca7fd4c27aed0d4ccfbfea567b094a27d75a6c7cc43dae236d1805ed3db535',1,'cv']]], - ['colorspace_5fyuv444p_1117',['COLORSPACE_YUV444P',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a8beca7fd4c27aed0d4ccfbfea567b094a8be25c5947fe013a57d08c2b56423a2b',1,'cv']]], - ['colorspaces_1118',['Colorspaces',['https://docs.opencv.org/4.2.0/df/d9d/tutorial_py_colorspaces.html',1,'Changing Colorspaces'],['https://docs.opencv.org/4.2.0/db/d64/tutorial_js_colorspaces.html',1,'Changing Colorspaces']]], - ['colpivhouseholderqr_1119',['ColPivHouseholderQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html',1,'Eigen']]], - ['colpivhouseholderqr_1120',['colPivHouseholderQr',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adee8c19c833245bbb00a591dce68e8a4',1,'Eigen::MatrixBase::colPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adee8c19c833245bbb00a591dce68e8a4',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::colPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adee8c19c833245bbb00a591dce68e8a4',1,'MatrixBase< Solve< Decomposition, RhsType > >::colPivHouseholderQr()']]], - ['colpivhouseholderqr_1121',['ColPivHouseholderQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a9d8a92c2a2f0debe5454812372237ed4',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a1aa6a5b95380df0ceb224cb833316d4f',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a65782010a93a4c9ef4a9191ac8fe30bc',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a5965d4fdebc04b2df71d67ff0b2d0c2c',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a9d8a92c2a2f0debe5454812372237ed4',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a1aa6a5b95380df0ceb224cb833316d4f',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a65782010a93a4c9ef4a9191ac8fe30bc',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a5965d4fdebc04b2df71d67ff0b2d0c2c',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR(Index rows, Index cols)']]], - ['colpivhouseholderqr_3c_20matrixtype_20_3e_1122',['ColPivHouseholderQR< MatrixType >',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html',1,'']]], - ['colpivhouseholderqrpreconditioner_1123',['ColPivHouseholderQRPreconditioner',['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56eabd2e2f4875c5b4b6e602a433d90c4e5e',1,'Eigen::ColPivHouseholderQRPreconditioner'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56eabd2e2f4875c5b4b6e602a433d90c4e5e',1,'ColPivHouseholderQRPreconditioner(Global Namespace)']]], - ['colrange_1124',['colRange',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a7256892911593daf1bdefb183d6fd29e',1,'cv::cuda::GpuMat::colRange(int startcol, int endcol) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#acfcbd3a61ca20ec908dc6de76ef6e5bb',1,'cv::cuda::GpuMat::colRange(Range r) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#adb4d4ba56dc63484445f278b25819b90',1,'cv::cudev::GpuMat_::colRange(int startcol, int endcol) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ae3b1cd86db92d50c5776742796ecc8d1',1,'cv::cudev::GpuMat_::colRange(Range r) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aadc8f9210fe4dec50513746c246fa8d9',1,'cv::Mat::colRange(int startcol, int endcol) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#acccb63e44eba6ba81ead99881bd1997e',1,'cv::Mat::colRange(const Range &r) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#adc6ffa253b779dd078638ad996e17c2f',1,'cv::UMat::colRange(int startcol, int endcol) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ade9f05c6bae4f6de8b24cc71d29f4b8a',1,'cv::UMat::colRange(const Range &r) const']]], - ['cols_1125',['cols',['https://docs.opencv.org/4.2.0/dc/dd4/structcv_1_1cudev_1_1AffineMapPtrSz.html#ab04103a5cadd697f16551ec1d06a5538',1,'cv::cudev::AffineMapPtrSz::cols'],['https://docs.opencv.org/4.2.0/d1/d0a/structcv_1_1cudev_1_1BinaryTransformPtrSz.html#a45bd65681effecae503f07ac7388dcf9',1,'cv::cudev::BinaryTransformPtrSz::cols'],['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#ab7fc946112369fa8dfe9da2f3bcc907c',1,'cv::cudev::BrdBase::cols'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#ab4a86b939e2e5ce4e9cde73f3c49de1b',1,'cv::cudev::BrdConstant::cols'],['https://docs.opencv.org/4.2.0/db/d1c/structcv_1_1cudev_1_1CommonAreaInterPtrSz.html#a3fe3f0ac6fde783c6782e7439147facd',1,'cv::cudev::CommonAreaInterPtrSz::cols'],['https://docs.opencv.org/4.2.0/d2/df7/structcv_1_1cudev_1_1ConstantPtrSz.html#a53f800055b4a3659730a9dcfaa2825b5',1,'cv::cudev::ConstantPtrSz::cols'],['https://docs.opencv.org/4.2.0/d2/d00/structcv_1_1cudev_1_1CubicInterPtrSz.html#a302d953d0d2647a34327f752da10fbe1',1,'cv::cudev::CubicInterPtrSz::cols'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1cudev_1_1DerivXPtrSz.html#a093bb5e030fc3adbb677f07cc9955593',1,'cv::cudev::DerivXPtrSz::cols'],['https://docs.opencv.org/4.2.0/d2/dfc/structcv_1_1cudev_1_1DerivYPtrSz.html#a51cb03036af851d30b5e02cf1f52a11e',1,'cv::cudev::DerivYPtrSz::cols'],['https://docs.opencv.org/4.2.0/de/d2e/structcv_1_1cudev_1_1GlobPtrSz.html#adb3ca4dbb9b8925ab9b421d769aba582',1,'cv::cudev::GlobPtrSz::cols'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a9265a32d8d29fe29804a0cb8f57213e9',1,'cv::cuda::GpuMat::cols'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a637b04a3a6e107d9bdb16eba7ca238eb',1,'cv::cuda::HostMem::cols'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1cudev_1_1IntegerAreaInterPtrSz.html#ad4910674af0d4fd16d88db715bc5ccb8',1,'cv::cudev::IntegerAreaInterPtrSz::cols'],['https://docs.opencv.org/4.2.0/da/dd9/structcv_1_1cudev_1_1LaplacianPtrSz.html#ad1a2c27552dfe905142ce3052816fb9d',1,'cv::cudev::LaplacianPtrSz::cols'],['https://docs.opencv.org/4.2.0/d9/d2e/structcv_1_1cudev_1_1LinearInterPtrSz.html#a9a0fae7a594a696ae9b6c0aa73e2943d',1,'cv::cudev::LinearInterPtrSz::cols'],['https://docs.opencv.org/4.2.0/d5/d22/structcv_1_1cudev_1_1LutPtrSz.html#ab14ec3cd4a74a39f07867b3e44562cec',1,'cv::cudev::LutPtrSz::cols'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa3e5a47585c9ef6a0842556739155e3e',1,'cv::Mat::cols'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a7b4aa3ea06463a63874cfd82d59e4a75',1,'cv::gapi::own::detail::MatHeader::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'cv::Matx::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< _Tp, cn, 1 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, 1, 3 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, 2, 2 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, 2, 3 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, 3, 3 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, 3, 4 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, 4, 4 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, cn, 1 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< float, 2, 3 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< float, 3, 3 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< float, cn, 1 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< float_type, 4, 4 >::cols'],['https://docs.opencv.org/4.2.0/df/dd0/structcv_1_1cudev_1_1NearestInterPtrSz.html#a50108e007807808b344af0ae132938b2',1,'cv::cudev::NearestInterPtrSz::cols'],['https://docs.opencv.org/4.2.0/de/d6d/structcv_1_1cudev_1_1PerspectiveMapPtrSz.html#aede7b7b2981e566658ec6ab21131c47f',1,'cv::cudev::PerspectiveMapPtrSz::cols'],['https://docs.opencv.org/4.2.0/dd/d03/structcv_1_1cudev_1_1RemapPtr1Sz.html#aca43acf1aee056f634e8189998dbd24e',1,'cv::cudev::RemapPtr1Sz::cols'],['https://docs.opencv.org/4.2.0/d4/d59/structcv_1_1cudev_1_1RemapPtr2Sz.html#a9160c7e2fa0b96bb89809ef99ee618f8',1,'cv::cudev::RemapPtr2Sz::cols'],['https://docs.opencv.org/4.2.0/d3/d8a/structcv_1_1cudev_1_1ResizePtrSz.html#ae4826d69a30bdd765d42c8e89f035f11',1,'cv::cudev::ResizePtrSz::cols'],['https://docs.opencv.org/4.2.0/d2/d88/structcv_1_1cudev_1_1ScharrXPtrSz.html#ab58b3393067a6ca22c986d378f5682e3',1,'cv::cudev::ScharrXPtrSz::cols'],['https://docs.opencv.org/4.2.0/dd/def/structcv_1_1cudev_1_1ScharrYPtrSz.html#a42596ceb7190bc2d7fd08f62ad1cdd62',1,'cv::cudev::ScharrYPtrSz::cols'],['https://docs.opencv.org/4.2.0/d0/d19/structcv_1_1cudev_1_1SingleMaskChannelsSz.html#aa09300172aab353ae6f832a82332ba9b',1,'cv::cudev::SingleMaskChannelsSz::cols'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1cudev_1_1SobelXPtrSz.html#a3ef86e44c716aa79f52588b4c73cdd78',1,'cv::cudev::SobelXPtrSz::cols'],['https://docs.opencv.org/4.2.0/dd/dc6/structcv_1_1cudev_1_1SobelYPtrSz.html#ae513366ea296315544d37ab5b450b99b',1,'cv::cudev::SobelYPtrSz::cols'],['https://docs.opencv.org/4.2.0/d0/dc5/structcv_1_1cudev_1_1Texture.html#a17bbfc97ea7c60941c0161f2e9434a8f',1,'cv::cudev::Texture::cols'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a18cc40c5ec8a6b95317e5fe6abaca6fc',1,'cv::UMat::cols'],['https://docs.opencv.org/4.2.0/d0/db7/structcv_1_1cudev_1_1UnaryTransformPtrSz.html#a2a851b94fb1e8fc00ce6dfe7b751f3ad',1,'cv::cudev::UnaryTransformPtrSz::cols'],['https://docs.opencv.org/4.2.0/db/d9b/structcv_1_1cudev_1_1ZipPtrSz.html#a75e9833516adf7122d71e3346862c9da',1,'cv::cudev::ZipPtrSz::cols'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#abf46b7c02ec98a5b26820f79f7017b03',1,'cv::_InputArray::cols()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a66fc0bec98329378bdc5303654da5238',1,'cv::ogl::Buffer::cols()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a125aad6e3dfbc590e12b21c856282003',1,'cv::ogl::Texture2D::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::EigenBase::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< FullPivLU< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< HouseholderQR< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Inverse< PermutationType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< LLT< _MatrixType, _UpLo > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< PartialPivLU< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< PermutationWrapper< _IndicesType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SVDBase< Derived > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Transpose< MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< TriangularView< MatrixType, Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#a35475457c973a66539417b61449cbf5a',1,'Eigen::HouseholderSequence::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#ac78d2b46d4071963d3cab4a762de6129',1,'Eigen::IncompleteCholesky::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IndexedView.html#a6d5f355dd721df6d39482a04e5ffd44d',1,'Eigen::IndexedView::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#adb0a19af0c52f9f36160abe0d2de67e1',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'Eigen::PermutationBase::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'PermutationBase< PermutationWrapper< _IndicesType > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a0fc44f3781a869a3a410edd6691fd899',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'Eigen::SparseMatrix::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'SparseMatrix< Scalar >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'SparseMatrix< Scalar, ColMajor, int >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'Eigen::SparseMatrixBase::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< Transpose< MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a87730dd85f0d77de74bca724d0b21624',1,'Eigen::SparseQR::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#acf75fdb279f16d7c4907118ca3eb69ed',1,'Eigen::SPQR::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a12d7ac8a095cda817cd241f1aae2f8fb',1,'Eigen::TriangularView::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a12d7ac8a095cda817cd241f1aae2f8fb',1,'TriangularView< const Derived, Mode >::cols()']]], - ['cols_5f_1126',['cols_',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a9b94f166f96a521cba816a650283937f',1,'cv::rgbd::RgbdNormals']]], - ['colsatcompiletime_1127',['ColsAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da787f85fd67ee5985917eb2cef6e70441',1,'Eigen::DenseBase::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da787f85fd67ee5985917eb2cef6e70441',1,'DenseBase< ArrayWrapper< ExpressionType > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da787f85fd67ee5985917eb2cef6e70441',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da787f85fd67ee5985917eb2cef6e70441',1,'DenseBase< Solve< Decomposition, RhsType > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a27ba349f075d026c1f51d1ec69aa5b14',1,'Eigen::SparseMatrixBase::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a27ba349f075d026c1f51d1ec69aa5b14',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a27ba349f075d026c1f51d1ec69aa5b14',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a27ba349f075d026c1f51d1ec69aa5b14',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a27ba349f075d026c1f51d1ec69aa5b14',1,'SparseMatrixBase< Transpose< MatrixType > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a27ba349f075d026c1f51d1ec69aa5b14',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::ColsAtCompileTime']]], - ['colspermutation_1128',['colsPermutation',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ab6ad43e6a6fb75726eae0d5499948f4a',1,'Eigen::ColPivHouseholderQR::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ab6ad43e6a6fb75726eae0d5499948f4a',1,'ColPivHouseholderQR< MatrixType >::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a601c67a4a0bbe9c7b25b885279db9ff2',1,'Eigen::CompleteOrthogonalDecomposition::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#abeda6d91e196c13d4dd8b7542fef3e17',1,'Eigen::FullPivHouseholderQR::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a4b9e6a3c7ee9326e3ae1672a109462f9',1,'Eigen::SparseLU::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a22f63d6baabc4dff27320776d9a1a3a1',1,'Eigen::SparseQR::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a6c4ad8d482dd7f23029c428dbd8e13e9',1,'Eigen::SPQR::colsPermutation()']]], - ['colstride_1129',['colStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#af8b144e79782a441448d59e00834f31a',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::colStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#af1bac522aee4402639189f387592000b',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::colStride()']]], - ['colwise_1130',['colwise',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1bdb06bdae22712b53d52adb3419a15',1,'Eigen::DenseBase::colwise()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1bdb06bdae22712b53d52adb3419a15',1,'DenseBase< ArrayWrapper< ExpressionType > >::colwise()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1bdb06bdae22712b53d52adb3419a15',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::colwise()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1bdb06bdae22712b53d52adb3419a15',1,'DenseBase< Solve< Decomposition, RhsType > >::colwise()']]], - ['combine_1131',['combine',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#ac95f9fffb50ea01bba71c07c526475cf',1,'cv::gapi::GKernelPackage::combine'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a9806f062f79116a09c2ed0ad9449e58f',1,'std::locale::combine()'],['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#ab3c55a390c722279ced6f56523fa01a7',1,'cv::gapi::combine(const GKernelPackage &lhs, const GKernelPackage &rhs)'],['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#a8ed430e3586586ec357daa4cdc3cc51f',1,'cv::gapi::combine(const GKernelPackage &a, const GKernelPackage &b, Ps &&... rest)']]], - ['combineddescriptor_1132',['CombinedDescriptor',['https://docs.opencv.org/4.2.0/d4/d5b/classcv_1_1stereo_1_1CombinedDescriptor.html',1,'cv::stereo::CombinedDescriptor< step_start, step_end, step_inc, nr_img, class >'],['https://docs.opencv.org/4.2.0/d4/d5b/classcv_1_1stereo_1_1CombinedDescriptor.html#ad8b335a3124478695b51b7363ee51910',1,'cv::stereo::CombinedDescriptor::CombinedDescriptor()']]], - ['comehere_1133',['comehere',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac20b315e6b2ac06929fe20ebed4ad90c',1,'cv::datasets::comehere'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac20b315e6b2ac06929fe20ebed4ad90c',1,'comehere(Global Namespace)']]], - ['commainitializer_1134',['CommaInitializer',['https://eigen.tuxfamily.org/dox/structEigen_1_1CommaInitializer.html',1,'Eigen']]], - ['command_5ft_1135',['command_t',['../structcommands_1_1command__t.html',1,'commands']]], - ['commandbase_1136',['CommandBase',['../classcommands_1_1CommandBase.html',1,'commands']]], - ['commandlineparser_1137',['CommandLineParser',['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html',1,'cv::CommandLineParser'],['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#ad0bb71c0bc9800e90bfdc44ff406293e',1,'cv::CommandLineParser::CommandLineParser(int argc, const char *const argv[], const String &keys)'],['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#a614095229293b2ab780cadd41a83313a',1,'cv::CommandLineParser::CommandLineParser(const CommandLineParser &parser)']]], - ['common_20pitfalls_1138',['Common pitfalls',['https://eigen.tuxfamily.org/dox/TopicPitfalls.html',1,'']]], - ['common_2ehpp_1139',['common.hpp',['https://docs.opencv.org/4.2.0/dc/d9d/modules_2core_2include_2opencv2_2core_2cuda_2common_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/de9/contrib_2modules_2cudev_2include_2opencv2_2cudev_2common_8hpp.html',1,'(Global Namespace)']]], - ['common_5ftype_1140',['common_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04263.html',1,'std']]], - ['common_5ftype_3c_20_5ftp_2c_20_5ftp_20_3e_1141',['common_type< _Tp, _Tp >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04263.html',1,'']]], - ['common_5ftype_3c_20_5ftypes_2e_2e_2e_20_3e_1142',['common_type< _Types... >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04263.html',1,'']]], - ['common_5ftype_5ft_1143',['common_type_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga3ef38e934006ae2422e5a7f136238d22',1,'std::common_type_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga3ef38e934006ae2422e5a7f136238d22',1,'common_type_t(Global Namespace)']]], - ['commonareainterptr_1144',['CommonAreaInterPtr',['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html',1,'cv::cudev']]], - ['commonareainterptrsz_1145',['CommonAreaInterPtrSz',['https://docs.opencv.org/4.2.0/db/d1c/structcv_1_1cudev_1_1CommonAreaInterPtrSz.html',1,'cv::cudev']]], - ['comp_5fellint_5f1_1146',['comp_ellint_1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gac559500c604c43ea943d593c9ad9d289',1,'std::comp_ellint_1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga35acc5bbe07b74718e22e5e7abe52fec',1,'std::tr1::comp_ellint_1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gac559500c604c43ea943d593c9ad9d289',1,'comp_ellint_1(_Tp __k)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga35acc5bbe07b74718e22e5e7abe52fec',1,'comp_ellint_1(_Tp __k)(Global Namespace)']]], - ['comp_5fellint_5f1f_1147',['comp_ellint_1f',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga7fb5be999a8125cf7e55e630eb8444a1',1,'std::comp_ellint_1f()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga7fb5be999a8125cf7e55e630eb8444a1',1,'comp_ellint_1f()(Global Namespace)']]], - ['comp_5fellint_5f1l_1148',['comp_ellint_1l',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga7247d3dd77c1ff5df3c059fed862dc48',1,'std::comp_ellint_1l()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga7247d3dd77c1ff5df3c059fed862dc48',1,'comp_ellint_1l()(Global Namespace)']]], - ['comp_5fellint_5f2_1149',['comp_ellint_2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga22fcc678829f0daf2de257896378e7e0',1,'std::comp_ellint_2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga67dca5d65386e74a0e2f17d842f0d450',1,'std::tr1::comp_ellint_2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga22fcc678829f0daf2de257896378e7e0',1,'comp_ellint_2(_Tp __k)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga67dca5d65386e74a0e2f17d842f0d450',1,'comp_ellint_2(_Tp __k)(Global Namespace)']]], - ['comp_5fellint_5f2f_1150',['comp_ellint_2f',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga21700f2f125c42b1f1da1f9c7eea1135',1,'std::comp_ellint_2f()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga21700f2f125c42b1f1da1f9c7eea1135',1,'comp_ellint_2f()(Global Namespace)']]], - ['comp_5fellint_5f2l_1151',['comp_ellint_2l',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga47b647ec386c8d4b18a030c97842df18',1,'std::comp_ellint_2l()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga47b647ec386c8d4b18a030c97842df18',1,'comp_ellint_2l()(Global Namespace)']]], - ['comp_5fellint_5f3_1152',['comp_ellint_3',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gad833404645e24b7f0598a640ff92d623',1,'std::comp_ellint_3()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga61ba4b9c23985c1d0ae83cf48b180231',1,'std::tr1::comp_ellint_3()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gad833404645e24b7f0598a640ff92d623',1,'comp_ellint_3(_Tp __k, _Tpn __nu)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga61ba4b9c23985c1d0ae83cf48b180231',1,'comp_ellint_3(_Tp __k, _Tpn __nu)(Global Namespace)']]], - ['comp_5fellint_5f3f_1153',['comp_ellint_3f',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga76834d3112f777703330892303267a39',1,'std::comp_ellint_3f()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga76834d3112f777703330892303267a39',1,'comp_ellint_3f()(Global Namespace)']]], - ['comp_5fellint_5f3l_1154',['comp_ellint_3l',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1ca081fee102cd0d4d6b091285e495e5',1,'std::comp_ellint_3l()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1ca081fee102cd0d4d6b091285e495e5',1,'comp_ellint_3l()(Global Namespace)']]], - ['comparator_1155',['comparator',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#afa5ae49218fbf90c102f306f618b1cf3',1,'cv::dnn_objdetect::InferBbox']]], - ['compare_1156',['compare',['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1img__hash_1_1ImgHashBase.html#a444a3e9ec792cf029385809393f84ad5',1,'cv::img_hash::ImgHashBase::compare()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a967b5317590fba87cc166bb8d03a1f2b',1,'__gnu_cxx::__versa_string::compare(const __versa_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac72042b419538e58816048f02d8a939c',1,'__gnu_cxx::__versa_string::compare(size_type __pos, size_type __n, const __versa_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a75d59248b3ce3544737ae337ec0e45e6',1,'__gnu_cxx::__versa_string::compare(size_type __pos1, size_type __n1, const __versa_string &__str, size_type __pos2, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a43985f2d884a45395bfad2efc5c6e8cf',1,'__gnu_cxx::__versa_string::compare(const _CharT *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a03ec24fe3c64fb1b05ff8e9de14c086f',1,'__gnu_cxx::__versa_string::compare(size_type __pos, size_type __n1, const _CharT *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a7e89f6009dd81acd8a93cedef5e88e65',1,'__gnu_cxx::__versa_string::compare(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'__gnu_debug::basic_string::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'__gnu_debug::basic_string::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'__gnu_debug::basic_string::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< _CharT >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< _CharT >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< _CharT >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< _CharT >::compare(const _CharT *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< _CharT >::compare(size_type __pos, size_type __n1, const _CharT *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< _CharT >::compare(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< _CharT, _Traits, _Allocator >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< _CharT, _Traits, _Allocator >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< _CharT, _Traits, _Allocator >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< _CharT, _Traits, _Allocator >::compare(const _CharT *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< _CharT, _Traits, _Allocator >::compare(size_type __pos, size_type __n1, const _CharT *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< _CharT, _Traits, _Allocator >::compare(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::compare(const _Elem *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::compare(size_type __pos, size_type __n1, const _Elem *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::compare(size_type __pos, size_type __n1, const _Elem *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< char >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< char >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< char >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< char >::compare(const char *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< char >::compare(size_type __pos, size_type __n1, const char *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< char >::compare(size_type __pos, size_type __n1, const char *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< char, char_traits< char >, _Byte_alloc >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< char, char_traits< char >, _Byte_alloc >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< char, char_traits< char >, _Byte_alloc >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< char, char_traits< char >, _Byte_alloc >::compare(const char *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::compare(size_type __pos, size_type __n1, const char *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< char, char_traits< char >, _Byte_alloc >::compare(size_type __pos, size_type __n1, const char *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< char_type, _Traits, _Alloc >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< char_type, _Traits, _Alloc >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< char_type, _Traits, _Alloc >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< char_type, _Traits, _Alloc >::compare(const char_type *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< char_type, _Traits, _Alloc >::compare(size_type __pos, size_type __n1, const char_type *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< char_type, _Traits, _Alloc >::compare(size_type __pos, size_type __n1, const char_type *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< value_type >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< value_type >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< value_type >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< value_type >::compare(const value_type *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< value_type >::compare(size_type __pos, size_type __n1, const value_type *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< value_type >::compare(size_type __pos, size_type __n1, const value_type *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'std::basic_string::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'std::basic_string::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'std::basic_string::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'std::basic_string::compare(const _CharT *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'std::basic_string::compare(size_type __pos, size_type __n1, const _CharT *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'std::basic_string::compare(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ac7757ff95f04e364fc1230c2945f27fc',1,'std::collate::compare()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ac7757ff95f04e364fc1230c2945f27fc',1,'std::collate_byname::compare()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#af3e0ace5e44267f4c24c53b5a1793747',1,'std::sub_match::compare(const sub_match &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#af573275c5c3507af4d59175f72a3dfd0',1,'std::sub_match::compare(const string_type &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#a938d59ee36df109ba5d20ac59a1b90e5',1,'std::sub_match::compare(const value_type *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#af573275c5c3507af4d59175f72a3dfd0',1,'std::sub_match::compare(const string_type &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#a938d59ee36df109ba5d20ac59a1b90e5',1,'std::sub_match::compare(const value_type *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#af3e0ace5e44267f4c24c53b5a1793747',1,'sub_match< _Bi_iter >::compare(const sub_match &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#af573275c5c3507af4d59175f72a3dfd0',1,'sub_match< _Bi_iter >::compare(const string_type &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#a938d59ee36df109ba5d20ac59a1b90e5',1,'sub_match< _Bi_iter >::compare(const value_type *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#af573275c5c3507af4d59175f72a3dfd0',1,'sub_match< _Bi_iter >::compare(const string_type &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#a938d59ee36df109ba5d20ac59a1b90e5',1,'sub_match< _Bi_iter >::compare(const value_type *__s) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga303cfb72acf8cbb36d884650c09a3a97',1,'cv::compare()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga4d41cd679f4a83862a3de71a6057db54',1,'cv::cuda::compare()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga303cfb72acf8cbb36d884650c09a3a97',1,'compare(InputArray src1, InputArray src2, OutputArray dst, int cmpop)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga4d41cd679f4a83862a3de71a6057db54',1,'compare(InputArray src1, InputArray src2, OutputArray dst, int cmpop, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/dab/group__core__hal__interface__compare.html',1,'Element-wise compare']]], - ['comparehist_1157',['compareHist',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gaf4190090efa5c47cb367cf97a9a519bd',1,'cv::compareHist(InputArray H1, InputArray H2, int method)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga41a249ba9a536bf2b47e95f8c7dd42b0',1,'cv::compareHist(const SparseMat &H1, const SparseMat &H2, int method)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gaf4190090efa5c47cb367cf97a9a519bd',1,'compareHist(InputArray H1, InputArray H2, int method)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga41a249ba9a536bf2b47e95f8c7dd42b0',1,'compareHist(const SparseMat &H1, const SparseMat &H2, int method)(Global Namespace)']]], - ['comparesegments_1158',['compareSegments',['https://docs.opencv.org/4.2.0/db/d73/classcv_1_1LineSegmentDetector.html#a9ecad1316ba3035aeffcf6d62c74d2cd',1,'cv::LineSegmentDetector']]], - ['comparison_1159',['Histogram Comparison',['https://docs.opencv.org/4.2.0/d8/dc8/tutorial_histogram_comparison.html',1,'']]], - ['comparison_20classes_1160',['Comparison Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01507.html',1,'']]], - ['compatible_20depth_20sensors_1161',['compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors'],['https://docs.opencv.org/4.2.0/d7/d6f/tutorial_kinect_openni.html',1,'Using Kinect and other OpenNI compatible depth sensors']]], - ['compensation_1162',['Exposure Compensation',['https://docs.opencv.org/4.2.0/dd/dff/group__stitching__exposure.html',1,'']]], - ['compilation_20arguments_1163',['G-API Graph Compilation Arguments',['https://docs.opencv.org/4.2.0/d9/d29/group__gapi__compile__args.html',1,'']]], - ['compilation_20for_20arm_20based_20linux_20systems_1164',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]], - ['compile_1165',['compile',['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#ab11bcc0578f9aa5ec8f8eaf6cda0dfa8',1,'cv::GComputation::compile(GMetaArgs &&in_metas, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a3c996ca8f04d5809b82191aae04a34ac',1,'cv::GComputation::compile(const Ts &... metas) -> typename std::enable_if< detail::are_meta_descrs< Ts... >::value, GCompiled >::type'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a86a31579919bfba49316f27093829abc',1,'cv::GComputation::compile(const Ts &... meta_and_compile_args) -> typename std::enable_if< detail::are_meta_descrs_but_last< Ts... >::value &&std::is_same< GCompileArgs, detail::last_type_t< Ts... > >::value, GCompiled >::type'],['https://docs.opencv.org/4.2.0/dd/d0d/classcv_1_1GComputationT_3_01R_07Args_8_8_8_08_4.html#ac03cbfa702322905fa459a2e1227c70d',1,'cv::GComputationT< R(Args...)>::compile(detail::ProtoToMetaT< Args >... inDescs)'],['https://docs.opencv.org/4.2.0/dd/d0d/classcv_1_1GComputationT_3_01R_07Args_8_8_8_08_4.html#a35d49b60a82e9b05b55cb27b4b765dc0',1,'cv::GComputationT< R(Args...)>::compile(detail::ProtoToMetaT< Args >... inDescs, GCompileArgs &&args)'],['https://docs.opencv.org/4.2.0/dd/d97/classcv_1_1GComputationT_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4.html#af1298850b3b7a5784262ab515d821967',1,'cv::GComputationT< std::tuple< R... >(Args...)>::compile(detail::ProtoToMetaT< Args >... inDescs)'],['https://docs.opencv.org/4.2.0/dd/d97/classcv_1_1GComputationT_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4.html#a833267fe5098a5dc5fca58fbab458d09',1,'cv::GComputationT< std::tuple< R... >(Args...)>::compile(detail::ProtoToMetaT< Args >... inDescs, GCompileArgs &&args)']]], - ['compile_5fargs_1166',['compile_args',['https://docs.opencv.org/4.2.0/d9/d29/group__gapi__compile__args.html#ga3ccf2a52953f18bb3e4c01243cc4e679',1,'cv::compile_args()'],['https://docs.opencv.org/4.2.0/d9/d29/group__gapi__compile__args.html#ga3ccf2a52953f18bb3e4c01243cc4e679',1,'compile_args()(Global Namespace)']]], - ['compileargtag_1167',['CompileArgTag',['https://docs.opencv.org/4.2.0/dd/d3d/structcv_1_1detail_1_1CompileArgTag.html',1,'cv::detail']]], - ['compileargtag_3c_20cv_3a_3agapi_3a_3agkernelpackage_20_3e_1168',['CompileArgTag< cv::gapi::GKernelPackage >',['https://docs.opencv.org/4.2.0/d5/d58/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1GKernelPackage_01_4.html',1,'cv::detail']]], - ['compileargtag_3c_20cv_3a_3agapi_3a_3agnetpackage_20_3e_1169',['CompileArgTag< cv::gapi::GNetPackage >',['https://docs.opencv.org/4.2.0/dc/dbf/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1GNetPackage_01_4.html',1,'cv::detail']]], - ['compileargtag_3c_20cv_3a_3agapi_3a_3aplaidml_3a_3aconfig_20_3e_1170',['CompileArgTag< cv::gapi::plaidml::config >',['https://docs.opencv.org/4.2.0/da/d3c/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1plaidml_1_1config_01_4.html',1,'cv::detail']]], - ['compileargtag_3c_20cv_3a_3agapi_3a_3ause_5fonly_20_3e_1171',['CompileArgTag< cv::gapi::use_only >',['https://docs.opencv.org/4.2.0/df/d53/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1use__only_01_4.html',1,'cv::detail']]], - ['compileargtag_3c_20cv_3a_3agapi_3a_3awip_3a_3adraw_3a_3afreetype_5ffont_20_3e_1172',['CompileArgTag< cv::gapi::wip::draw::freetype_font >',['https://docs.opencv.org/4.2.0/d8/da3/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1wip_1_1draw_1_1freetype__font_01_4.html',1,'cv::detail']]], - ['compileargtag_3c_20cv_3a_3agraph_5fdump_5fpath_20_3e_1173',['CompileArgTag< cv::graph_dump_path >',['https://docs.opencv.org/4.2.0/d3/d64/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1graph__dump__path_01_4.html',1,'cv::detail']]], - ['compileargtag_3c_20gfluidoutputrois_20_3e_1174',['CompileArgTag< GFluidOutputRois >',['https://docs.opencv.org/4.2.0/d7/d5e/structcv_1_1detail_1_1CompileArgTag_3_01GFluidOutputRois_01_4.html',1,'cv::detail']]], - ['compileargtag_3c_20gfluidparallelfor_20_3e_1175',['CompileArgTag< GFluidParallelFor >',['https://docs.opencv.org/4.2.0/de/d5f/structcv_1_1detail_1_1CompileArgTag_3_01GFluidParallelFor_01_4.html',1,'cv::detail']]], - ['compileargtag_3c_20gfluidparalleloutputrois_20_3e_1176',['CompileArgTag< GFluidParallelOutputRois >',['https://docs.opencv.org/4.2.0/d5/dc7/structcv_1_1detail_1_1CompileArgTag_3_01GFluidParallelOutputRois_01_4.html',1,'cv::detail']]], - ['compiler_20making_20a_20wrong_20assumption_20on_20stack_20alignment_1177',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], - ['compiler_5fhints_2ehpp_1178',['compiler_hints.hpp',['https://docs.opencv.org/4.2.0/d6/d2e/compiler__hints_8hpp.html',1,'']]], - ['compileravailable_1179',['compilerAvailable',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a91136834ce5687aa8669c798402beb56',1,'cv::ocl::Device']]], - ['compilestreaming_1180',['compileStreaming',['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a53af72f7dafa8cbf416581628aaa32fd',1,'cv::GComputation::compileStreaming(GMetaArgs &&in_metas, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a2fbcc669f338b5d5aca60d9ca95cc669',1,'cv::GComputation::compileStreaming(GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#aaadc813c176e6a992c76e51d07090cef',1,'cv::GComputation::compileStreaming(const Ts &... metas) -> typename std::enable_if< detail::are_meta_descrs< Ts... >::value, GStreamingCompiled >::type'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#aa2a3cae818b02d21ace48f348cb88a0a',1,'cv::GComputation::compileStreaming(const Ts &... meta_and_compile_args) -> typename std::enable_if< detail::are_meta_descrs_but_last< Ts... >::value &&std::is_same< GCompileArgs, detail::last_type_t< Ts... > >::value, GStreamingCompiled >::type'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a731e812ec6ba458983dc10cc0df40325',1,'cv::GComputation::compileStreaming(const std::tuple< Ts... > &meta_and_compile_args, detail::Seq< IIs... >)']]], - ['compiletime_5fsettings_2eh_1181',['compiletime_settings.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00887.html',1,'']]], - ['compileworkgroupsize_1182',['compileWorkGroupSize',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a45d1fe80bed5fe85974a83d08c67ca53',1,'cv::ocl::Kernel']]], - ['completeframeaccordingtoflow_1183',['completeFrameAccordingToFlow',['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#gac7e9d9a4c1095962a1b4780b4fb859df',1,'cv::videostab::completeFrameAccordingToFlow()'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#gac7e9d9a4c1095962a1b4780b4fb859df',1,'completeFrameAccordingToFlow()(Global Namespace)']]], - ['completeorthogonaldecomposition_1184',['CompleteOrthogonalDecomposition',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html',1,'Eigen::CompleteOrthogonalDecomposition< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a7ba33814fd3fdc62f6179cdcd655c679',1,'Eigen::CompleteOrthogonalDecomposition::CompleteOrthogonalDecomposition()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#afcfaf7a395f853247c23bb52b1ffb1cc',1,'Eigen::CompleteOrthogonalDecomposition::CompleteOrthogonalDecomposition(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a082295ba2aac35a8b8b9e2d46e1d7ce4',1,'Eigen::CompleteOrthogonalDecomposition::CompleteOrthogonalDecomposition(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#aa6c282dd7452ebe754024edb71bebd09',1,'Eigen::CompleteOrthogonalDecomposition::CompleteOrthogonalDecomposition(Index rows, Index cols)']]], - ['completeorthogonaldecomposition_1185',['completeOrthogonalDecomposition',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae90b6846f05bd30b8d52b66e427e3e09',1,'Eigen::MatrixBase::completeOrthogonalDecomposition()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae90b6846f05bd30b8d52b66e427e3e09',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::completeOrthogonalDecomposition()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae90b6846f05bd30b8d52b66e427e3e09',1,'MatrixBase< Solve< Decomposition, RhsType > >::completeOrthogonalDecomposition()']]], - ['completesymm_1186',['completeSymm',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6847337c0c55769e115a70e0f011b5ca',1,'cv::completeSymm()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6847337c0c55769e115a70e0f011b5ca',1,'completeSymm()(Global Namespace)']]], - ['complex_1187',['Complex',['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html',1,'cv']]], - ['complex_1188',['complex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html',1,'std::complex< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00053.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a4243bd8ee861d7f2e640127085fb4c48',1,'std::complex::complex(const _Tp &__r=_Tp(), const _Tp &__i=_Tp())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a49d7da00378dd1c3bd5984ffdce09349',1,'std::complex::complex(const complex< _Up > &__z)']]], - ['complex_1189',['Complex',['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#af3bec7e8907947043569bf8a366a84f0',1,'cv::Complex::Complex()'],['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#ad7d6fe6d84cff0cd7ad5e46dccdb5c1b',1,'cv::Complex::Complex(_Tp _re, _Tp _im=0)']]], - ['complex_20numbers_1190',['Complex Numbers',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html',1,'']]], - ['complex_2eh_1191',['complex.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00002.html',1,'']]], - ['complex_3c_20double_20_3e_1192',['complex< double >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01935.html',1,'std']]], - ['complex_3c_20float_20_3e_1193',['complex< float >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01931.html',1,'std']]], - ['complex_3c_20long_20double_20_3e_1194',['complex< long double >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01939.html',1,'std']]], - ['complexd_1195',['Complexd',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3a5d93a0cbc1d360dbd3abf218bbb4ae',1,'cv::Complexd'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3a5d93a0cbc1d360dbd3abf218bbb4ae',1,'Complexd(Global Namespace)']]], - ['complexeigensolver_1196',['ComplexEigenSolver',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html',1,'Eigen::ComplexEigenSolver< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a3322a21574c61eefd450c003515ad802',1,'Eigen::ComplexEigenSolver::ComplexEigenSolver()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a748de5c1e7f730e16421e6d451437600',1,'Eigen::ComplexEigenSolver::ComplexEigenSolver(const EigenBase< InputType > &matrix, bool computeEigenvectors=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a86751f64ebcd5c554551fb5eaaa02db7',1,'Eigen::ComplexEigenSolver::ComplexEigenSolver(Index size)']]], - ['complexf_1197',['Complexf',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaab0325d447419758daf5de162ffb051f',1,'cv::Complexf'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaab0325d447419758daf5de162ffb051f',1,'Complexf(Global Namespace)']]], - ['complexmatrixtype_1198',['ComplexMatrixType',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#af61fe57877d51cfb50178f78534042f0',1,'Eigen::ComplexSchur::ComplexMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#af61fe57877d51cfb50178f78534042f0',1,'ComplexSchur< MatrixType >::ComplexMatrixType']]], - ['complexscalar_1199',['ComplexScalar',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a3604c99a69fac3bee42c88cb2b589143',1,'Eigen::ComplexEigenSolver::ComplexScalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#ae1a4713b53f821867fbad617e426832a',1,'Eigen::ComplexSchur::ComplexScalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#ae1a4713b53f821867fbad617e426832a',1,'ComplexSchur< MatrixType >::ComplexScalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a4d0b2a773357d0a6ec98e026f04002ed',1,'Eigen::EigenSolver::ComplexScalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#abdec07af91db1345bb4c74066e3d0ea7',1,'Eigen::GeneralizedEigenSolver::ComplexScalar']]], - ['complexschur_1200',['ComplexSchur',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html',1,'Eigen::ComplexSchur< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a9c92c6e4c33890d2d063c5c8dd22777d',1,'Eigen::ComplexSchur::ComplexSchur(const EigenBase< InputType > &matrix, bool computeU=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#ad707d9978dc36b3b15e460c2a83f4093',1,'Eigen::ComplexSchur::ComplexSchur(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a9c92c6e4c33890d2d063c5c8dd22777d',1,'ComplexSchur< MatrixType >::ComplexSchur(const EigenBase< InputType > &matrix, bool computeU=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#ad707d9978dc36b3b15e460c2a83f4093',1,'ComplexSchur< MatrixType >::ComplexSchur(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)']]], - ['complexschur_3c_20matrixtype_20_3e_1201',['ComplexSchur< MatrixType >',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html',1,'']]], - ['complexvectortype_1202',['ComplexVectorType',['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#acfd144329aca76882069da2fc5d53ef5',1,'Eigen::GeneralizedEigenSolver']]], - ['component_1203',['component',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a7fed80561a9b46a1a924ac6cb334ac85',1,'cv::Stitcher']]], - ['component_20analysis_20pca_1204',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], - ['compose_1205',['compose',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html#a4bcfdd6ada1197995073aae3f1e136ed',1,'cv::reg::Map::compose()'],['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#a1c31351af50695e92ebd870da823fdd3',1,'cv::reg::MapAffine::compose()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#a50def8f2eef5f2f984b331fccc401f8b',1,'cv::reg::MapProjec::compose()'],['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html#a282771bc3d4cd6fef9306c0e29c2795a',1,'cv::reg::MapShift::compose()']]], - ['compose1_1206',['compose1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga0099fa0a5f616d3bc2ba21b81902fc5f',1,'__gnu_cxx::compose1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga0099fa0a5f616d3bc2ba21b81902fc5f',1,'compose1()(Global Namespace)']]], - ['compose2_1207',['compose2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga3a4bcb8b957d6c73414c6a5eda0fef17',1,'__gnu_cxx::compose2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga3a4bcb8b957d6c73414c6a5eda0fef17',1,'compose2()(Global Namespace)']]], - ['compose_5fmotion_1208',['compose_motion',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#ad6bfe905b168b3a45ba709cd8979ecaf',1,'cv::omnidir::internal']]], - ['composepanorama_1209',['composePanorama',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a3217156f7deba256ecd7790ef34008ed',1,'cv::Stitcher::composePanorama(OutputArray pano)'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#acc8409a6b2e548de1653f0dc5c2ccb02',1,'cv::Stitcher::composePanorama(InputArrayOfArrays images, OutputArray pano)']]], - ['composert_1210',['composeRT',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga044b03d81f99370db05c52c3d0b46599',1,'cv::composeRT()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga044b03d81f99370db05c52c3d0b46599',1,'composeRT(InputArray rvec1, InputArray tvec1, InputArray rvec2, InputArray tvec2, OutputArray rvec3, OutputArray tvec3, OutputArray dr3dr1=noArray(), OutputArray dr3dt1=noArray(), OutputArray dr3dr2=noArray(), OutputArray dr3dt2=noArray(), OutputArray dt3dr1=noArray(), OutputArray dt3dt1=noArray(), OutputArray dt3dr2=noArray(), OutputArray dt3dt2=noArray())(Global Namespace)']]], - ['composite_5findex_2eh_1211',['composite_index.h',['https://docs.opencv.org/4.2.0/d1/d7b/composite__index_8h.html',1,'']]], - ['compositingresol_1212',['compositingResol',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad13d2d50b253e471fbaf041b9a044571',1,'cv::Stitcher']]], - ['composition_20functionality_1213',['G-API Drawing and composition functionality',['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'']]], - ['composition_20functions_1214',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], - ['compress_5ffeature_1215',['compress_feature',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a1b5f5c8d18a9f66f4ad78573ac81d29e',1,'cv::TrackerKCF::Params']]], - ['compressed_5finput_1216',['COMPRESSED_INPUT',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af1ea864e1c19796e6264ebb3950c0b9aae860ef9fda481bb6730e8794009c99b5',1,'cv::ml::StatModel']]], - ['compressed_5fsize_1217',['compressed_size',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#aff68ad20f63d588215fe57507b39394d',1,'cv::TrackerKCF::Params']]], - ['compressedaccessbit_1218',['CompressedAccessBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gaed0244284da47a2b8661261431173caf',1,'Eigen::CompressedAccessBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gaed0244284da47a2b8661261431173caf',1,'CompressedAccessBit(Global Namespace)']]], - ['compressedrectilinearportraitprojector_1219',['CompressedRectilinearPortraitProjector',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1detail_1_1CompressedRectilinearPortraitProjector.html',1,'cv::detail']]], - ['compressedrectilinearportraitwarper_1220',['CompressedRectilinearPortraitWarper',['https://docs.opencv.org/4.2.0/de/d9a/classcv_1_1CompressedRectilinearPortraitWarper.html',1,'cv::CompressedRectilinearPortraitWarper'],['https://docs.opencv.org/4.2.0/dd/dc8/classcv_1_1detail_1_1CompressedRectilinearPortraitWarper.html',1,'cv::detail::CompressedRectilinearPortraitWarper'],['https://docs.opencv.org/4.2.0/dd/dc8/classcv_1_1detail_1_1CompressedRectilinearPortraitWarper.html#a5ad1e730652815931dfcc74a268fc3b5',1,'cv::detail::CompressedRectilinearPortraitWarper::CompressedRectilinearPortraitWarper()'],['https://docs.opencv.org/4.2.0/de/d9a/classcv_1_1CompressedRectilinearPortraitWarper.html#ab8e275b58a1e3592528e4d72b4a6fa6a',1,'cv::CompressedRectilinearPortraitWarper::CompressedRectilinearPortraitWarper()']]], - ['compressedrectilinearprojector_1221',['CompressedRectilinearProjector',['https://docs.opencv.org/4.2.0/db/dbb/structcv_1_1detail_1_1CompressedRectilinearProjector.html',1,'cv::detail']]], - ['compressedrectilinearwarper_1222',['CompressedRectilinearWarper',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1CompressedRectilinearWarper.html',1,'cv::CompressedRectilinearWarper'],['https://docs.opencv.org/4.2.0/dd/dbe/classcv_1_1detail_1_1CompressedRectilinearWarper.html',1,'cv::detail::CompressedRectilinearWarper'],['https://docs.opencv.org/4.2.0/dd/dbe/classcv_1_1detail_1_1CompressedRectilinearWarper.html#a1d839e593941f89469c196b52117a4db',1,'cv::detail::CompressedRectilinearWarper::CompressedRectilinearWarper()'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1CompressedRectilinearWarper.html#a08636b91dd4802fb26765788c4f4e826',1,'cv::CompressedRectilinearWarper::CompressedRectilinearWarper()']]], - ['computational_20photography_1223',['Computational Photography',['https://docs.opencv.org/4.2.0/d1/d0d/group__photo.html',1,'Computational Photography'],['https://docs.opencv.org/4.2.0/d0/d07/tutorial_py_table_of_contents_photo.html',1,'Computational Photography']]], - ['computational_20photography_20photo_20module_1224',['Computational photography (photo module)',['https://docs.opencv.org/4.2.0/da/de7/tutorial_table_of_content_photo.html',1,'']]], - ['computationinfo_1225',['ComputationInfo',['https://eigen.tuxfamily.org/dox/group__enums.html#ga85fad7b87587764e5cf6b513a9e0ee5e',1,'Eigen::ComputationInfo'],['https://eigen.tuxfamily.org/dox/group__enums.html#ga85fad7b87587764e5cf6b513a9e0ee5e',1,'ComputationInfo(Global Namespace)']]], - ['compute_1226',['compute',['https://docs.opencv.org/4.2.0/d2/d60/structcv_1_1quality_1_1QualityGMSD_1_1__mat__data.html#a23ada52e22c69dea0d95aa564d38b5b2',1,'cv::quality::QualityGMSD::_mat_data::compute()'],['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a5d724db11621fa1c97b544c18a0eba57',1,'cv::quality::QualitySSIM::_mat_data::compute()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1bgsegm_1_1BackgroundSubtractorLSBPDesc.html#a480813c97c3e081c81e20ceb5cf839bf',1,'cv::bgsegm::BackgroundSubtractorLSBPDesc::compute()'],['https://docs.opencv.org/4.2.0/dc/d12/classcv_1_1face_1_1BIF.html#ae544b29b59ef4492bec632e8d82341d1',1,'cv::face::BIF::compute()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a93b1d7ddaef646567638f10d2cf01c48',1,'cv::line_descriptor::BinaryDescriptor::compute(const Mat &image, std::vector< KeyLine > &keylines, Mat &descriptors, bool returnFloatDescr=false) const'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a11360f24b8d2f6aa7b5ec62bc3a861e6',1,'cv::line_descriptor::BinaryDescriptor::compute(const std::vector< Mat > &images, std::vector< std::vector< KeyLine > > &keylines, std::vector< Mat > &descriptors, bool returnFloatDescr=false) const'],['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#ac4e1019795995a9395aded0a9c1c3ed6',1,'cv::BOWImgDescriptorExtractor::compute(InputArray image, std::vector< KeyPoint > &keypoints, OutputArray imgDescriptor, std::vector< std::vector< int > > *pointIdxsOfClusters=0, Mat *descriptors=0)'],['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#ad6fd3ce0bbe507644c0979178f2384f4',1,'cv::BOWImgDescriptorExtractor::compute(InputArray keypointDescriptors, OutputArray imgDescriptor, std::vector< std::vector< int > > *pointIdxsOfClusters=0)'],['https://docs.opencv.org/4.2.0/d8/d9f/classcv_1_1LMSolver_1_1Callback.html#a995ab645fb3a0b3c06624882fe29b4b0',1,'cv::LMSolver::Callback::compute()'],['https://docs.opencv.org/4.2.0/dd/d63/classcv_1_1cuda_1_1CornernessCriteria.html#a973a98647acb7906712004d9a8710e4a',1,'cv::cuda::CornernessCriteria::compute()'],['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1tbm_1_1CosDistance.html#a69b05979ba0e6188dd5307e47ee5ed82',1,'cv::tbm::CosDistance::compute(const cv::Mat &descr1, const cv::Mat &descr2) override'],['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1tbm_1_1CosDistance.html#a043a02276cc0b4961900c928ee362d54',1,'cv::tbm::CosDistance::compute(const std::vector< cv::Mat > &descrs1, const std::vector< cv::Mat > &descrs2) override'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#a12744f1611a374fb06ba251d9d2fec86',1,'cv::xfeatures2d::DAISY::compute(InputArray image, std::vector< KeyPoint > &keypoints, OutputArray descriptors) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#a01b04d5e486b703c97ec62f489408219',1,'cv::xfeatures2d::DAISY::compute(InputArrayOfArrays images, std::vector< std::vector< KeyPoint > > &keypoints, OutputArrayOfArrays descriptors) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#afdd0a1606d0375f2446b75a947de6758',1,'cv::xfeatures2d::DAISY::compute(InputArray image, Rect roi, OutputArray descriptors)=0'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#a989b3fe67aadfebf4180ec85dc2cfc4d',1,'cv::xfeatures2d::DAISY::compute(InputArray image, OutputArray descriptors)=0'],['https://docs.opencv.org/4.2.0/dc/de5/classcv_1_1cuda_1_1DFT.html#a7f695268107fa3d5bf1d1b44131c9f47',1,'cv::cuda::DFT::compute()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#ab3cce8d56f4fc5e1d530b5931e1e8dc0',1,'cv::Feature2D::compute(InputArray image, std::vector< KeyPoint > &keypoints, OutputArray descriptors)'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#ad18e1027ffc8d9cffbb2d59c1d05b89e',1,'cv::Feature2D::compute(InputArrayOfArrays images, std::vector< std::vector< KeyPoint > > &keypoints, OutputArrayOfArrays descriptors)'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#ab4287267081959ec77c01269dbfcd373',1,'cv::cuda::HOG::compute()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a38cd712cd5a6d9ed0344731fcd121e8b',1,'cv::HOGDescriptor::compute()'],['https://docs.opencv.org/4.2.0/d9/dc1/classcv_1_1tbm_1_1IDescriptorDistance.html#a77e83d046f18ff6cca86ea02798dc785',1,'cv::tbm::IDescriptorDistance::compute(const cv::Mat &descr1, const cv::Mat &descr2)=0'],['https://docs.opencv.org/4.2.0/d9/dc1/classcv_1_1tbm_1_1IDescriptorDistance.html#a4fde2cf7e6e3284e863cc4fd7690d47e',1,'cv::tbm::IDescriptorDistance::compute(const std::vector< cv::Mat > &descrs1, const std::vector< cv::Mat > &descrs2)=0'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1tbm_1_1IImageDescriptor.html#ac1b41ae13e108dd34211332601227540',1,'cv::tbm::IImageDescriptor::compute(const cv::Mat &mat, cv::Mat &descr)=0'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1tbm_1_1IImageDescriptor.html#ab5900e3072b5a60ae4a5f426aba9b8f4',1,'cv::tbm::IImageDescriptor::compute(const std::vector< cv::Mat > &mats, std::vector< cv::Mat > &descrs)=0'],['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1img__hash_1_1ImgHashBase.html#ae2d9288db370089dfd8aab85d5e0b0f3',1,'cv::img_hash::ImgHashBase::compute()'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a68c714a24483a1afd1864fbac7fe2048',1,'cv::LDA::compute()'],['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1tbm_1_1MatchTemplateDistance.html#afe5fac6636bf374ea3dc84afb7617da1',1,'cv::tbm::MatchTemplateDistance::compute(const cv::Mat &descr1, const cv::Mat &descr2) override'],['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1tbm_1_1MatchTemplateDistance.html#ad26bd4ab92a6e1b771edbdf8a9560d3c',1,'cv::tbm::MatchTemplateDistance::compute(const std::vector< cv::Mat > &descrs1, const std::vector< cv::Mat > &descrs2) override'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#ad88ca6c6231d5accf4b3a595d7ebaf0c',1,'cv::rgbd::Odometry::compute(const Mat &srcImage, const Mat &srcDepth, const Mat &srcMask, const Mat &dstImage, const Mat &dstDepth, const Mat &dstMask, OutputArray Rt, const Mat &initRt=Mat()) const'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#af706a3bb35d2b69737e7f4492c4ece4f',1,'cv::rgbd::Odometry::compute(Ptr< OdometryFrame > &srcFrame, Ptr< OdometryFrame > &dstFrame, OutputArray Rt, const Mat &initRt=Mat()) const'],['https://docs.opencv.org/4.2.0/da/d83/classcv_1_1quality_1_1QualityBase.html#a9fb4f74d30937bbb9e88ec6b79c11c0f',1,'cv::quality::QualityBase::compute()'],['https://docs.opencv.org/4.2.0/d8/d99/classcv_1_1quality_1_1QualityBRISQUE.html#a011769e13ad8537dcec8f698a298ab1b',1,'cv::quality::QualityBRISQUE::compute(InputArray img) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d8/d99/classcv_1_1quality_1_1QualityBRISQUE.html#a65b0526a369edf57c03cd1f816083b44',1,'cv::quality::QualityBRISQUE::compute(InputArray img, const cv::String &model_file_path, const cv::String &range_file_path)'],['https://docs.opencv.org/4.2.0/d8/d81/classcv_1_1quality_1_1QualityGMSD.html#a4fbafa647a6fea744a1f5b632fc12c46',1,'cv::quality::QualityGMSD::compute(InputArray cmp) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d8/d81/classcv_1_1quality_1_1QualityGMSD.html#aa856e2c46c35bbe28fafc76e82e3cda6',1,'cv::quality::QualityGMSD::compute(InputArray ref, InputArray cmp, OutputArray qualityMap)'],['https://docs.opencv.org/4.2.0/d7/d80/classcv_1_1quality_1_1QualityMSE.html#a82ba740a06f48562a08517079712218c',1,'cv::quality::QualityMSE::compute(InputArrayOfArrays cmpImgs) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d7/d80/classcv_1_1quality_1_1QualityMSE.html#a0924aec83d5a487e1887b1d789fe3377',1,'cv::quality::QualityMSE::compute(InputArray ref, InputArray cmp, OutputArray qualityMap)'],['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#a4c08dcc4944fa7ae2bd9dc00607c3f1a',1,'cv::quality::QualityPSNR::compute(InputArray cmp) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#ab9616d5da0df37b5753b99ae6d36ba69',1,'cv::quality::QualityPSNR::compute(InputArray ref, InputArray cmp, OutputArray qualityMap, double maxPixelValue=QualityPSNR::MAX_PIXEL_VALUE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d9/db5/classcv_1_1quality_1_1QualitySSIM.html#a49d5ecc72e83b8876c8293244c3667e4',1,'cv::quality::QualitySSIM::compute(InputArray cmp) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d9/db5/classcv_1_1quality_1_1QualitySSIM.html#a7f1967a8334e28d8bef80fbe2f340f8c',1,'cv::quality::QualitySSIM::compute(InputArray ref, InputArray cmp, OutputArray qualityMap)'],['https://docs.opencv.org/4.2.0/d5/d34/classcv_1_1tbm_1_1ResizedImageDescriptor.html#a279de4e671330361c8e52215c8bb627e',1,'cv::tbm::ResizedImageDescriptor::compute(const cv::Mat &mat, cv::Mat &descr) override'],['https://docs.opencv.org/4.2.0/d5/d34/classcv_1_1tbm_1_1ResizedImageDescriptor.html#a7b7218ca700607c07aefaf17769f2b75',1,'cv::tbm::ResizedImageDescriptor::compute(const std::vector< cv::Mat > &mats, std::vector< cv::Mat > &descrs) override'],['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#a3e67269c9b88e72d43708222e1372655',1,'cv::cuda::StereoBeliefPropagation::compute(InputArray left, InputArray right, OutputArray disparity, Stream &stream)=0'],['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#a381446ab436269d86cf6701b85387c02',1,'cv::cuda::StereoBeliefPropagation::compute(InputArray data, OutputArray disparity, Stream &stream=Stream::Null())=0'],['https://docs.opencv.org/4.2.0/db/d8a/classcv_1_1cuda_1_1StereoBM.html#a0f968fd564212a3670daf59dce8433a6',1,'cv::cuda::StereoBM::compute()'],['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#a03f7087df1b2c618462eb98898841345',1,'cv::StereoMatcher::compute()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#ac2abae8a2b57dff2bcfcb1077f1235c4',1,'cv::stereo::StereoMatcher::compute()'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a76f0b2044df458160292045a3d3714c6',1,'cv::SVD::compute(InputArray src, OutputArray w, OutputArray u, OutputArray vt, int flags=0)'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#aac85e0fc50c1e3c9716bb35dd7b9bcd2',1,'cv::SVD::compute(InputArray src, OutputArray w, int flags=0)'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a75e78203f975321abae4127dc4ee10df',1,'cv::SVD::compute(const Matx< _Tp, m, n > &a, Matx< _Tp, nm, 1 > &w, Matx< _Tp, m, nm > &u, Matx< _Tp, n, nm > &vt)'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a6a8081ff2e54fc43a7a844c2df58476c',1,'cv::SVD::compute(const Matx< _Tp, m, n > &a, Matx< _Tp, nm, 1 > &w)'],['https://docs.opencv.org/4.2.0/d7/da2/classcv_1_1TrackerFeature.html#a75e87cbd885ec32a493968cd1189bf28',1,'cv::TrackerFeature::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1BDCSVD.html#a4923796555b973dba9fe3f8744cac23e',1,'Eigen::BDCSVD::compute(const MatrixType &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1BDCSVD.html#a96232f52930af6006bc7dc1e58df1ba7',1,'Eigen::BDCSVD::compute(const MatrixType &matrix, unsigned int computationOptions)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#abaf5be01b1e3035a4de0b19f5b63549e',1,'Eigen::CholmodBase::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#abaf5be01b1e3035a4de0b19f5b63549e',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#abaf5be01b1e3035a4de0b19f5b63549e',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#abaf5be01b1e3035a4de0b19f5b63549e',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#abaf5be01b1e3035a4de0b19f5b63549e',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a608016776319abe8fe96b85f83c8dd3d',1,'Eigen::ColPivHouseholderQR::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a608016776319abe8fe96b85f83c8dd3d',1,'ColPivHouseholderQR< MatrixType >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#aeb7e38c6db5369f5c974f3786e94c1f0',1,'Eigen::ComplexEigenSolver::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a3543d2c286563108cd9ace672bbb1c09',1,'Eigen::ComplexSchur::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a3543d2c286563108cd9ace672bbb1c09',1,'ComplexSchur< MatrixType >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a38d032b75b3e75640e3db42e7ab20c24',1,'Eigen::EigenSolver::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a3745d70b826c12d33b8d34f26a5c96e7',1,'Eigen::FullPivHouseholderQR::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a0a3c3b1bbafa31a03567a4573ebabc79',1,'Eigen::FullPivLU::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#a275910b47dfe5f40211dcb59cfd68f3c',1,'Eigen::GeneralizedEigenSolver::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedSelfAdjointEigenSolver.html#a724764fe196612b752042692156ed023',1,'Eigen::GeneralizedSelfAdjointEigenSolver::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a239a6fd42c57aab3c0b048c47fde3004',1,'Eigen::HessenbergDecomposition::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a239a6fd42c57aab3c0b048c47fde3004',1,'HessenbergDecomposition< MatrixType >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a7966bedeebbeaa7a8fe4dd1da3797a0b',1,'Eigen::IncompleteCholesky::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteLUT.html#a488e37ab51d8ed37a297eeca521f1817',1,'Eigen::IncompleteLUT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a7dfa55c55e82d697bde227696a630914',1,'Eigen::IterativeSolverBase::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#acc7b9a4068cf7b69ae3227d217ed7efd',1,'Eigen::JacobiSVD::compute(const MatrixType &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a5dab376cc86cf0d36674bcdad4af3f5a',1,'Eigen::JacobiSVD::compute(const MatrixType &matrix, unsigned int computationOptions)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a1777488d0bde83d5f23a622bf8431ef2',1,'Eigen::LDLT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#aecb45daf711328e0804f272131142b57',1,'Eigen::LLT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLDLT.html#a7713ed923776078c7b3502edd4648215',1,'Eigen::PastixLDLT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLLT.html#a5d6c118b2723d7e88291e138a132f215',1,'Eigen::PastixLLT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLU.html#acb4fddee92e3e74fd67ced0afaa99d35',1,'Eigen::PastixLU::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a2b6847964d9f1903193cc3e67c196849',1,'Eigen::RealQZ::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a2b6847964d9f1903193cc3e67c196849',1,'RealQZ< MatrixType >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a60caf9ffad11d728ea458c4dd36d0a98',1,'Eigen::RealSchur::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a60caf9ffad11d728ea458c4dd36d0a98',1,'RealSchur< MatrixType >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#adf397f6bce9f93c4b0139a47e261fc24',1,'Eigen::SelfAdjointEigenSolver::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholesky.html#a2228f0937ba77a513c907ab1c3504d42',1,'Eigen::SimplicialCholesky::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html#a9a741744dda2261cae26cddf96a35bf0',1,'Eigen::SimplicialCholeskyBase::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a3917387194863ce995478c2dedf60e73',1,'Eigen::SimplicialLDLT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a329535cf4d5e5370cb8b5cacd8cb6a6a',1,'Eigen::SimplicialLLT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#ad2f4e92cebb96ca75fede58f13178c24',1,'Eigen::SparseLU::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a08587fcc35e496692787f09617a9d97f',1,'Eigen::SparseQR::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a28cb3ef7914ecb6fdae1935b53f6be40',1,'Eigen::SuperLUBase::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a28cb3ef7914ecb6fdae1935b53f6be40',1,'SuperLUBase< _MatrixType, SuperILU< _MatrixType > >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a28cb3ef7914ecb6fdae1935b53f6be40',1,'SuperLUBase< _MatrixType, SuperLU< _MatrixType > >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#acd288abb081d3b40b87e4b98cd8f6ee9',1,'Eigen::Tridiagonalization::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UmfPackLU.html#a05fb2b5717ebd67e46b83439721ceee7',1,'Eigen::UmfPackLU::compute()']]], - ['compute2_1227',['compute2',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#a2c3540b57b4f74b4e87778e3cb338bb0',1,'cv::BOWImgDescriptorExtractor']]], - ['compute_5fintegral_1228',['compute_integral',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a94facf2a415987df65c1f46bc86c02cc',1,'cv::CvHaarEvaluator']]], - ['computeasync_1229',['computeAsync',['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1cuda_1_1Feature2DAsync.html#a77ebc500b04962e7df8a882557ca4ffc',1,'cv::cuda::Feature2DAsync']]], - ['computebadpixelpercent_1230',['computeBadPixelPercent',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga6db28b4258a9a820d5cf75b63cd51543',1,'cv::ximgproc::computeBadPixelPercent()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga6db28b4258a9a820d5cf75b63cd51543',1,'computeBadPixelPercent()(Global Namespace)']]], - ['computebboxstd_1231',['computeBboxStd',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaba913ce390921fb9cb212de4198665a2',1,'cv::ppf_match_3d::computeBboxStd()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaba913ce390921fb9cb212de4198665a2',1,'computeBboxStd()(Global Namespace)']]], - ['computebinarymap_1232',['computeBinaryMap',['https://docs.opencv.org/4.2.0/d5/d87/classcv_1_1saliency_1_1StaticSaliency.html#a540a87d2afadbda338b79ca1f0ea9e39',1,'cv::saliency::StaticSaliency']]], - ['computebitmaps_1233',['computeBitmaps',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a05dfd95e34ecb2c02b179d0a9d790b22',1,'cv::AlignMTB']]], - ['computecorrespondepilines_1234',['computeCorrespondEpilines',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga19e3401c94c44b47c229be6e51d158b7',1,'cv::computeCorrespondEpilines()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga19e3401c94c44b47c229be6e51d158b7',1,'computeCorrespondEpilines()(Global Namespace)']]], - ['computedatamodulationterm_1235',['computeDataModulationTerm',['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1structured__light_1_1SinusoidalPattern.html#a698be96d5eda062ff2673cc98b5fe55c',1,'cv::structured_light::SinusoidalPattern']]], - ['computedirect_1236',['computeDirect',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#afe520161701f5f585bcc4cedb8657bd1',1,'Eigen::SelfAdjointEigenSolver']]], - ['computedistance_1237',['computeDistance',['https://docs.opencv.org/4.2.0/dc/dbf/classcv_1_1ShapeDistanceExtractor.html#aba29b7775eca6bd6c4b4f5e300094097',1,'cv::ShapeDistanceExtractor']]], - ['computeecc_1238',['computeECC',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gae94247c0014ff6497a3f85e60eab0a66',1,'cv::computeECC()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gae94247c0014ff6497a3f85e60eab0a66',1,'computeECC()(Global Namespace)']]], - ['computeeigenvectors_1239',['ComputeEigenvectors',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a7f7d17fba3c9bb92158e346d5979d0f4',1,'Eigen::ComputeEigenvectors'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a7f7d17fba3c9bb92158e346d5979d0f4',1,'ComputeEigenvectors(Global Namespace)']]], - ['computefeatures_1240',['computeFeatures',['https://docs.opencv.org/4.2.0/d8/d99/classcv_1_1quality_1_1QualityBRISQUE.html#a71931f138fa9b2db5109e2b50f3a8a74',1,'cv::quality::QualityBRISQUE']]], - ['computefromhessenberg_1241',['computeFromHessenberg',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a05dfbf329047aba756a844f8fe2de314',1,'Eigen::ComplexSchur::computeFromHessenberg()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a05dfbf329047aba756a844f8fe2de314',1,'ComplexSchur< MatrixType >::computeFromHessenberg()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#ac4acc917dcaddefae5f35acd2c536d65',1,'Eigen::RealSchur::computeFromHessenberg()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#ac4acc917dcaddefae5f35acd2c536d65',1,'RealSchur< MatrixType >::computeFromHessenberg()']]], - ['computefromlocalsvdvalues_1242',['computeFromLocalSVDValues',['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1bgsegm_1_1BackgroundSubtractorLSBPDesc.html#af446a314110bb16bb49100ecdb38f498',1,'cv::bgsegm::BackgroundSubtractorLSBPDesc']]], - ['computefromtridiagonal_1243',['computeFromTridiagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a297893df7098c43278d385e4d4e23fe4',1,'Eigen::SelfAdjointEigenSolver']]], - ['computefullu_1244',['ComputeFullU',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a9fa9302d510cee20c26311154937e23f',1,'Eigen::ComputeFullU'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a9fa9302d510cee20c26311154937e23f',1,'ComputeFullU(Global Namespace)']]], - ['computefullv_1245',['ComputeFullV',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a36581f7c662f7def31efd500c284f930',1,'Eigen::ComputeFullV'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a36581f7c662f7def31efd500c284f930',1,'ComputeFullV(Global Namespace)']]], - ['computegradient_1246',['computeGradient',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a1f76c51c08d69f2b8a0f079efc4bd093',1,'cv::HOGDescriptor']]], - ['computeimagefeatures_1247',['computeImageFeatures',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html#ga1e4ca67941780b89a36003eed2bb476e',1,'cv::detail::computeImageFeatures(const Ptr< Feature2D > &featuresFinder, InputArrayOfArrays images, std::vector< ImageFeatures > &features, InputArrayOfArrays masks=noArray())'],['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html#ga345c954d91511618cfb792235651963a',1,'cv::detail::computeImageFeatures(const Ptr< Feature2D > &featuresFinder, InputArray image, ImageFeatures &features, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html#ga1e4ca67941780b89a36003eed2bb476e',1,'computeImageFeatures(const Ptr< Feature2D > &featuresFinder, InputArrayOfArrays images, std::vector< ImageFeatures > &features, InputArrayOfArrays masks=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html#ga345c954d91511618cfb792235651963a',1,'computeImageFeatures(const Ptr< Feature2D > &featuresFinder, InputArray image, ImageFeatures &features, InputArray mask=noArray())(Global Namespace)']]], - ['computeimpl_1248',['computeImpl',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a998cf30a58b3c70e833167d96bc9548b',1,'cv::line_descriptor::BinaryDescriptor::computeImpl()'],['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a1cdbe9e377ebf8e8dd0ce4d70c10f01e',1,'cv::rgbd::FastICPOdometry::computeImpl()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a1c9e09d30453a7f3088d2a7d6afd495a',1,'cv::rgbd::ICPOdometry::computeImpl()'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a4cf0681bb36181a8dbb3340b0d0e667e',1,'cv::rgbd::Odometry::computeImpl()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#ad2a5f64789923118ace25a83efbaab7f',1,'cv::rgbd::RgbdICPOdometry::computeImpl()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#af50664123e41488c9b666a5c7d345b0f',1,'cv::rgbd::RgbdOdometry::computeImpl()'],['https://docs.opencv.org/4.2.0/d7/da2/classcv_1_1TrackerFeature.html#a3780ac17c97d771859509b1c04877112',1,'cv::TrackerFeature::computeImpl()'],['https://docs.opencv.org/4.2.0/d3/d4c/classcv_1_1TrackerFeatureFeature2d.html#a51992ef0c4d6f048641c92fef99641b4',1,'cv::TrackerFeatureFeature2d::computeImpl()'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a884bdbae42c796ef25e0e1abf25a1abf',1,'cv::TrackerFeatureHAAR::computeImpl()'],['https://docs.opencv.org/4.2.0/d2/da3/classcv_1_1TrackerFeatureHOG.html#a28a83e80a4789f61f13f7360a55af5e5',1,'cv::TrackerFeatureHOG::computeImpl()'],['https://docs.opencv.org/4.2.0/dc/d73/classcv_1_1TrackerFeatureLBP.html#a37df0f236629168d8c9d02ca4dbe8ae9',1,'cv::TrackerFeatureLBP::computeImpl()']]], - ['computeinplace_1249',['computeInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#adb0b963d7d8f96492904e8eda03efbf5',1,'Eigen::CompleteOrthogonalDecomposition::computeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#a3a16530338a734971fc45efb0ef9ac94',1,'Eigen::HouseholderQR::computeInPlace()']]], - ['computeinverseanddetwithcheck_1250',['computeInverseAndDetWithCheck',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7baaf2fdec0191a2166cf9fd84a2dcb2',1,'Eigen::MatrixBase::computeInverseAndDetWithCheck()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7baaf2fdec0191a2166cf9fd84a2dcb2',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::computeInverseAndDetWithCheck()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7baaf2fdec0191a2166cf9fd84a2dcb2',1,'MatrixBase< Solve< Decomposition, RhsType > >::computeInverseAndDetWithCheck()']]], - ['computeinversewithcheck_1251',['computeInverseWithCheck',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a116f3b50d2af7dbdf7473e517a5b8b0f',1,'Eigen::MatrixBase::computeInverseWithCheck()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a116f3b50d2af7dbdf7473e517a5b8b0f',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::computeInverseWithCheck()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a116f3b50d2af7dbdf7473e517a5b8b0f',1,'MatrixBase< Solve< Decomposition, RhsType > >::computeInverseWithCheck()']]], - ['computejacobian_1252',['computeJacobian',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#ad6cec91dcb4298212e91bb5a796caa00',1,'cv::omnidir::internal']]], - ['computejacobianstereo_1253',['computeJacobianStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#ae817b8128ba1943eebdb8e10503c6c0f',1,'cv::omnidir::internal']]], - ['computemaxidx_1254',['computeMaxIdx',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#af297cd11054fd970602ca65ab1c90f4e',1,'cv::dnn::PoolingLayer']]], - ['computemeanreproerr_1255',['computeMeanReproErr',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a8c7e950ebb15a15631ef2af498728786',1,'cv::omnidir::internal::computeMeanReproErr(InputArrayOfArrays imagePoints, InputArrayOfArrays proImagePoints)'],['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a8c452345e36b893ed62b349e81f738fc',1,'cv::omnidir::internal::computeMeanReproErr(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints, InputArray K, InputArray D, double xi, InputArrayOfArrays omAll, InputArrayOfArrays tAll)']]], - ['computemeanreproerrstereo_1256',['computeMeanReproErrStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#af5ef20e9755bc2c48da36e3556c67090',1,'cv::omnidir::internal']]], - ['computemode_1257',['ComputeMode',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#af72c434adf30a6b60f977dffe3e926b0',1,'cv::cuda::DeviceInfo']]], - ['computemode_1258',['computeMode',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a23678f520226ce96c52f3df133c5e3bd',1,'cv::cuda::DeviceInfo']]], - ['computemodedefault_1259',['ComputeModeDefault',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#af72c434adf30a6b60f977dffe3e926b0a9cb256b0faff211d0f086b818627ad1b',1,'cv::cuda::DeviceInfo']]], - ['computemodeexclusive_1260',['ComputeModeExclusive',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#af72c434adf30a6b60f977dffe3e926b0aef6ab784c9893582b6d3631cce8a72db',1,'cv::cuda::DeviceInfo']]], - ['computemodeexclusiveprocess_1261',['ComputeModeExclusiveProcess',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#af72c434adf30a6b60f977dffe3e926b0a9809e20514e75a5ca802b17ae8da7169',1,'cv::cuda::DeviceInfo']]], - ['computemodeprohibited_1262',['ComputeModeProhibited',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#af72c434adf30a6b60f977dffe3e926b0a5262c70d1b04ff6a6b5471e8ffd93b35',1,'cv::cuda::DeviceInfo']]], - ['computemse_1263',['computeMSE',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaad2210013ec0118e542cb38a01cae416',1,'cv::ximgproc::computeMSE()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaad2210013ec0118e542cb38a01cae416',1,'computeMSE()(Global Namespace)']]], - ['computenmchannels_1264',['computeNMChannels',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga23fdd9364be7b67d104f814dd679fcde',1,'cv::text::computeNMChannels()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga23fdd9364be7b67d104f814dd679fcde',1,'computeNMChannels()(Global Namespace)']]], - ['computenormals_1265',['computeNormals',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gaef5ba3c97115c715298a620a145beffa',1,'cv::viz::computeNormals()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gaef5ba3c97115c715298a620a145beffa',1,'computeNormals()(Global Namespace)']]], - ['computenormalspc3d_1266',['computeNormalsPC3d',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaa74e62c7b2a8b8a70e44e42211fd00f5',1,'cv::ppf_match_3d::computeNormalsPC3d()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaa74e62c7b2a8b8a70e44e42211fd00f5',1,'computeNormalsPC3d()(Global Namespace)']]], - ['computeobjectimagepoints_1267',['computeObjectImagePoints',['https://docs.opencv.org/4.2.0/df/d8d/classcv_1_1randpattern_1_1RandomPatternCornerFinder.html#a4f9403aa890ab7af3a4f312fd5f28d82',1,'cv::randpattern::RandomPatternCornerFinder']]], - ['computeobjectimagepointsforsingle_1268',['computeObjectImagePointsForSingle',['https://docs.opencv.org/4.2.0/df/d8d/classcv_1_1randpattern_1_1RandomPatternCornerFinder.html#a325b35b85764b7228c595f71b1836e53',1,'cv::randpattern::RandomPatternCornerFinder']]], - ['computeorientation_1269',['computeOrientation',['https://docs.opencv.org/4.2.0/d8/d54/classcv_1_1ximgproc_1_1StructuredEdgeDetection.html#a70c5e2be7fb13e29cf46e447df1e3661',1,'cv::ximgproc::StructuredEdgeDetection::computeOrientation()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga42e4e05b414d11f3abc29612f058d249',1,'cv::sfm::computeOrientation()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga42e4e05b414d11f3abc29612f058d249',1,'computeOrientation()(Global Namespace)']]], - ['computephasemap_1270',['computePhaseMap',['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1structured__light_1_1SinusoidalPattern.html#a6062c0597d8fcba1525485157534f79b',1,'cv::structured_light::SinusoidalPattern']]], - ['computeprojectionmatrix_1271',['computeProjectionMatrix',['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#a16a26df9d1ddf4833fb8b2a801c369cf',1,'cv::viz::Camera']]], - ['computequadraticformdistance_1272',['computeQuadraticFormDistance',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1xfeatures2d_1_1PCTSignaturesSQFD.html#aa67416b7f8f179ebebd8ad5168e0a5b2',1,'cv::xfeatures2d::PCTSignaturesSQFD']]], - ['computequadraticformdistances_1273',['computeQuadraticFormDistances',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1xfeatures2d_1_1PCTSignaturesSQFD.html#a7c5ba83c3d322c5c3d85d5b6d2af18f5',1,'cv::xfeatures2d::PCTSignaturesSQFD']]], - ['computer_20vision_1274',['CUDA-accelerated Computer Vision',['https://docs.opencv.org/4.2.0/d1/d1e/group__cuda.html',1,'']]], - ['computer_20vision_20applications_1275',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], - ['computer_20vision_20cuda_20module_1276',['GPU-Accelerated Computer Vision (cuda module)',['https://docs.opencv.org/4.2.0/da/d2c/tutorial_table_of_content_gpu.html',1,'']]], - ['computer_20vision_20programs_1277',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], - ['computerecallprecisioncurve_1278',['computeRecallPrecisionCurve',['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#gaa7cacd54220a6da4ee05748a0329b754',1,'cv::computeRecallPrecisionCurve()'],['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#gaa7cacd54220a6da4ee05748a0329b754',1,'computeRecallPrecisionCurve()(Global Namespace)']]], - ['computereplacedclassifier_1279',['computeReplacedClassifier',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a49cf4da9698a3e75286786c69ab58cc8',1,'cv::TrackerStateEstimatorAdaBoosting']]], - ['computereplaceweakestclassifier_1280',['computeReplaceWeakestClassifier',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html#a458cd33276dbb79b45d99143ce955179',1,'cv::BaseClassifier']]], - ['computerotationscaling_1281',['computeRotationScaling',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a7213fd78501c1185c4a1441e33c812d3',1,'Eigen::Transform']]], - ['computesaliency_1282',['computeSaliency',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#ad27c4adb8b6b878aa4631ec98dadc4cc',1,'cv::saliency::MotionSaliencyBinWangApr2014::computeSaliency()'],['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#a0345fd711cda978a9cb33965386fa2b1',1,'cv::saliency::ObjectnessBING::computeSaliency()'],['https://docs.opencv.org/4.2.0/d9/dcd/classcv_1_1saliency_1_1Saliency.html#aeee4f8dae6dd3201fe8569bb7c4b7e19',1,'cv::saliency::Saliency::computeSaliency()'],['https://docs.opencv.org/4.2.0/da/dd0/classcv_1_1saliency_1_1StaticSaliencyFineGrained.html#ab46ae4db7c877c44f2c855ac00a690f5',1,'cv::saliency::StaticSaliencyFineGrained::computeSaliency()'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#a715a665c991956d7fa32c19348842834',1,'cv::saliency::StaticSaliencySpectralResidual::computeSaliency()']]], - ['computesaliencyimpl_1283',['computeSaliencyImpl',['https://docs.opencv.org/4.2.0/d2/df7/classcv_1_1saliency_1_1MotionSaliency.html#a8a81ef4ddbc42ce706718b2486b9ed21',1,'cv::saliency::MotionSaliency::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a9c277bff61ccf265cf419b133930999b',1,'cv::saliency::MotionSaliencyBinWangApr2014::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/d1/d82/classcv_1_1saliency_1_1Objectness.html#acea77635e8fb8b34076539a0d84b258b',1,'cv::saliency::Objectness::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#a38767fc30c8378c4399a9781cc875c78',1,'cv::saliency::ObjectnessBING::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/d9/dcd/classcv_1_1saliency_1_1Saliency.html#ab73249792e00181f0a38ae3437da29b7',1,'cv::saliency::Saliency::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/d5/d87/classcv_1_1saliency_1_1StaticSaliency.html#aa070431141cd2edccf0a2d614f1fbd37',1,'cv::saliency::StaticSaliency::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/da/dd0/classcv_1_1saliency_1_1StaticSaliencyFineGrained.html#a019c3dc8d94c833834793c7668f5b202',1,'cv::saliency::StaticSaliencyFineGrained::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#aeb831acb9eb303231f37b71d5bb69c9d',1,'cv::saliency::StaticSaliencySpectralResidual::computeSaliencyImpl()']]], - ['computescalingrotation_1284',['computeScalingRotation',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a247b079c63f46bb652b3776484838216',1,'Eigen::Transform']]], - ['computeselectedweakclassifier_1285',['computeSelectedWeakClassifier',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a04ffcae7c5aedaeff6f73cdbc6524f45',1,'cv::TrackerStateEstimatorAdaBoosting']]], - ['computesignature_1286',['computeSignature',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a23afba0a61f447c839fbf0134af817eb',1,'cv::xfeatures2d::PCTSignatures']]], - ['computesignatures_1287',['computeSignatures',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a7e64cf57c74009277db78e99d14af4d2',1,'cv::xfeatures2d::PCTSignatures']]], - ['computeswappedclassifier_1288',['computeSwappedClassifier',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a60bf59972bfd7a54ad334733b8b7ff29',1,'cv::TrackerStateEstimatorAdaBoosting']]], - ['computethinu_1289',['ComputeThinU',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9aa7fb4e98834788d0b1b0f2b8467d2527',1,'Eigen::ComputeThinU'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9aa7fb4e98834788d0b1b0f2b8467d2527',1,'ComputeThinU(Global Namespace)']]], - ['computethinv_1290',['ComputeThinV',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a540036417bfecf2e791a70948c227f47',1,'Eigen::ComputeThinV'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a540036417bfecf2e791a70948c227f47',1,'ComputeThinV(Global Namespace)']]], - ['computeu_1291',['computeU',['https://eigen.tuxfamily.org/dox/classEigen_1_1BDCSVD.html#a705a7c2709e1624ccc19aa748a78d473',1,'Eigen::BDCSVD::computeU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a705a7c2709e1624ccc19aa748a78d473',1,'Eigen::JacobiSVD::computeU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a705a7c2709e1624ccc19aa748a78d473',1,'Eigen::SVDBase::computeU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a705a7c2709e1624ccc19aa748a78d473',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::computeU()']]], - ['computev_1292',['computeV',['https://eigen.tuxfamily.org/dox/classEigen_1_1BDCSVD.html#a5f12efcb791eb007d4a4890ac5255ac4',1,'Eigen::BDCSVD::computeV()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a5f12efcb791eb007d4a4890ac5255ac4',1,'Eigen::JacobiSVD::computeV()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a5f12efcb791eb007d4a4890ac5255ac4',1,'Eigen::SVDBase::computeV()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a5f12efcb791eb007d4a4890ac5255ac4',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::computeV()']]], - ['computing_20sdk_20compatible_20depth_20sensors_1293',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], - ['concat_1294',['concat',['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a431bbdb55c4aaaa669b8aa7d9fe1cf2c',1,'cv::dnn']]], - ['concatenate_1295',['concatenate',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a82684a32c8dee80e0a82d992eb5a83fa',1,'cv::Affine3::concatenate()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a82684a32c8dee80e0a82d992eb5a83fa',1,'Affine3< float >::concatenate()']]], - ['concathor_1296',['concatHor',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga332791cecc4160115bbea9449ee11657',1,'cv::gapi::concatHor(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga5518633a98c85dea0a0a5c3da4f136e0',1,'cv::gapi::concatHor(const std::vector< GMat > &v)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga332791cecc4160115bbea9449ee11657',1,'concatHor(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga5518633a98c85dea0a0a5c3da4f136e0',1,'concatHor(const std::vector< GMat > &v)(Global Namespace)']]], - ['concatlayer_1297',['ConcatLayer',['https://docs.opencv.org/4.2.0/da/d5c/classcv_1_1dnn_1_1ConcatLayer.html',1,'cv::dnn']]], - ['concatvert_1298',['concatVert',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga1cd4abced53d37ad46907283c6b3fa36',1,'cv::gapi::concatVert(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga771d3a4a7dd392e51f1f0081b09aa7ff',1,'cv::gapi::concatVert(const std::vector< GMat > &v)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga1cd4abced53d37ad46907283c6b3fa36',1,'concatVert(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga771d3a4a7dd392e51f1f0081b09aa7ff',1,'concatVert(const std::vector< GMat > &v)(Global Namespace)']]], - ['concept_5fcheck_2eh_1299',['concept_check.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00308.html',1,'']]], - ['concepts_20of_20the_20homography_20explained_20with_20code_1300',['Basic concepts of the homography explained with code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'']]], - ['concurrence_2eh_1301',['concurrence.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01043.html',1,'']]], - ['concurrency_1302',['Concurrency',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01474.html',1,'']]], - ['concurrentkernels_1303',['concurrentKernels',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a327633202acda2a492931e366ee11477',1,'cv::cuda::DeviceInfo']]], - ['cond_5fdealtor_1304',['cond_dealtor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11375.html',1,'__gnu_pbds::detail']]], - ['cond_5fdealtor_2ehpp_1305',['cond_dealtor.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01139.html',1,'']]], - ['cond_5fdtor_1306',['cond_dtor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11875.html',1,'__gnu_pbds::detail::ov_tree_map']]], - ['cond_5fkey_5fdtor_5fentry_5fdealtor_2ehpp_1307',['cond_key_dtor_entry_dealtor.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01247.html',1,'']]], - ['condition_20variables_1308',['Condition Variables',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html',1,'']]], - ['condition_5fbase_1309',['condition_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10683.html',1,'__gnu_cxx']]], - ['condition_5fvariable_1310',['condition_variable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02051.html',1,'std::condition_variable'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00059.html',1,'(Global Namespace)']]], - ['condition_5fvariable_5fany_1311',['condition_variable_any',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02059.html',1,'std::_V2']]], - ['conditional_1312',['conditional',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03059.html',1,'std']]], - ['conditional_3c_20_5fusecache_3a_3avalue_2c_20std_3a_3abitset_3c_20_5fs_5fcache_5fsize_20_3e_2c_20_5fdummy_20_3e_1313',['conditional< _UseCache::value, std::bitset< _S_cache_size >, _Dummy >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03059.html',1,'']]], - ['conditional_5ft_1314',['conditional_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga3f79e9f15004fc524ff345fc510a2813',1,'std::conditional_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga3f79e9f15004fc524ff345fc510a2813',1,'conditional_t(Global Namespace)']]], - ['conditioning_1315',['Conditioning',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html',1,'']]], - ['conditioning_2ehpp_1316',['conditioning.hpp',['https://docs.opencv.org/4.2.0/d7/d09/conditioning_8hpp.html',1,'']]], - ['conf_5fhyperg_1317',['conf_hyperg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a2e17ccbbc4cbb99c987e875531d4a3de',1,'__gnu_cxx::conf_hyperg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01550.html#afd178133d3ebc657708ad8174baf2a74',1,'std::tr1::conf_hyperg()']]], - ['conf_5fhypergf_1318',['conf_hypergf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#abd18e600aa78c3f2b2f835039506c810',1,'__gnu_cxx']]], - ['conf_5fhypergl_1319',['conf_hypergl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a0a9853f30d8fa515a12cd45a92da832e',1,'__gnu_cxx']]], - ['conf_5fthresh_5f_1320',['conf_thresh_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a7496b2ad6eb9893b7cf20a723eb4cec7',1,'cv::detail::BundleAdjusterBase']]], - ['confidence_1321',['confidence',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#aa3e33ded91e2b39e21e943436f224eeb',1,'cv::detail::MatchesInfo::confidence'],['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#ad3b345249fcadb57e5b17979fe8387f2',1,'cv::tbm::TrackedObject::confidence']]], - ['confidencemap_1322',['ConfidenceMap',['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga361525545aeac12e56c6838b97cfba87',1,'cv::ConfidenceMap'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga361525545aeac12e56c6838b97cfba87',1,'ConfidenceMap(Global Namespace)']]], - ['confidencemaps_1323',['confidenceMaps',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a95872763ec0f430e93e852fbd00fbc40',1,'cv::TrackerModel']]], - ['confidences_1324',['confidences',['https://docs.opencv.org/4.2.0/d3/d34/structcv_1_1DetectionROI.html#a5263b762e36e5e3a772fc53ae825a61b',1,'cv::DetectionROI']]], - ['config_1325',['Config',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html',1,'cv::face::FacemarkAAM']]], - ['config_1326',['config',['https://docs.opencv.org/4.2.0/de/d39/structcv_1_1gapi_1_1plaidml_1_1config.html',1,'cv::gapi::plaidml']]], - ['config_1327',['Config',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html#aa40a2cb0325e4f6c812d51f8b56f6f74',1,'cv::face::FacemarkAAM::Config']]], - ['config_2eh_1328',['config.h',['https://docs.opencv.org/4.2.0/db/d16/config_8h.html',1,'']]], - ['configfile_1329',['configfile',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#ac9a1910494cbbc9142d560510d839348',1,'cv::face::FacemarkKazemi::Params']]], - ['configuration_1330',['Camera Configuration',['../cameraconfig.html',1,'']]], - ['configuration_2eprivate_2ehpp_1331',['configuration.private.hpp',['https://docs.opencv.org/4.2.0/d3/d08/configuration_8private_8hpp.html',1,'']]], - ['confthresh_1332',['confThresh',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#ae5421c7653929d73265431105631aecf',1,'cv::detail::BundleAdjusterBase']]], - ['conj_1333',['conj',['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#a6e911d2fb0bedec658406fc135f9d1a6',1,'cv::Complex::conj()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a8a413cd62a03ab2b886f3407f3fb0ea8',1,'cv::Scalar_::conj()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a8a413cd62a03ab2b886f3407f3fb0ea8',1,'Scalar_< double >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'cv::Vec::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< _Tp, 4 >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< double, 2 >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< double, 3 >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< double, 4 >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< double, GPCPatchDescriptor::nFeatures >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< double, nFeatures >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< float, 2 >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< float, 3 >::conj()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga556c10b533dbb99817a60942544cb6d4',1,'std::conj()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga556c10b533dbb99817a60942544cb6d4',1,'conj()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ab84f39a06a18e1ebb23f8be80345b79d',1,'Eigen::conj()']]], - ['conjgradsolver_1334',['ConjGradSolver',['https://docs.opencv.org/4.2.0/d0/d21/classcv_1_1ConjGradSolver.html',1,'cv']]], - ['conjugate_1335',['conjugate',['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ac71fa85a4f177b0aeb1026752aea5590',1,'Eigen::HouseholderSequence::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a5e63b775d0a93161ce6137ec0a17f6b0',1,'Eigen::QuaternionBase::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a5e63b775d0a93161ce6137ec0a17f6b0',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a5e63b775d0a93161ce6137ec0a17f6b0',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a5e63b775d0a93161ce6137ec0a17f6b0',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a6671a26f31ead5f6e14d1d7d1221d9ec',1,'Eigen::SelfAdjointView::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a6671a26f31ead5f6e14d1d7d1221d9ec',1,'SelfAdjointView< const Derived, UpLo >::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a53c6a7764a6610f4955788f6134a8d78',1,'Eigen::TriangularView::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a53c6a7764a6610f4955788f6134a8d78',1,'TriangularView< const Derived, Mode >::conjugate()']]], - ['conjugategradient_1336',['ConjugateGradient',['https://eigen.tuxfamily.org/dox/classEigen_1_1ConjugateGradient.html',1,'Eigen::ConjugateGradient< class, _UpLo, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ConjugateGradient.html#a92a9656ca9fa4da240194f89229255eb',1,'Eigen::ConjugateGradient::ConjugateGradient()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ConjugateGradient.html#ac10f778fcd137eca1f6057c8ddd3d644',1,'Eigen::ConjugateGradient::ConjugateGradient(const EigenBase< MatrixDerived > &A)']]], - ['conjugateif_1337',['conjugateIf',['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#afe117fafd579da0371861bec910599a3',1,'Eigen::HouseholderSequence::conjugateIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad50f99f2a8d8d8bb8eb79733af5fcf9b',1,'Eigen::SelfAdjointView::conjugateIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad50f99f2a8d8d8bb8eb79733af5fcf9b',1,'SelfAdjointView< const Derived, UpLo >::conjugateIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a3461c3e9ccb404c66291c298ec986af9',1,'Eigen::TriangularView::conjugateIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a3461c3e9ccb404c66291c298ec986af9',1,'TriangularView< const Derived, Mode >::conjugateIf()']]], - ['connect_1338',['connect',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a032292c7866fb72db251708b0e7c2bea',1,'cv::dnn::Net::connect(String outPin, String inpPin)'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a26615a67830b0045b68565c7e7dc1307',1,'cv::dnn::Net::connect(int outLayerId, int outNum, int inpLayerId, int inpNum)']]], - ['connectedcomponents_1339',['connectedComponents',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaedef8c7340499ca391d459122e51bef5',1,'cv::connectedComponents(InputArray image, OutputArray labels, int connectivity, int ltype, int ccltype)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gac2718a64ade63475425558aa669a943a',1,'cv::connectedComponents(InputArray image, OutputArray labels, int connectivity=8, int ltype=CV_32S)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaedef8c7340499ca391d459122e51bef5',1,'connectedComponents(InputArray image, OutputArray labels, int connectivity, int ltype, int ccltype)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gac2718a64ade63475425558aa669a943a',1,'connectedComponents(InputArray image, OutputArray labels, int connectivity=8, int ltype=CV_32S)(Global Namespace)']]], - ['connectedcomponentsalgorithmstypes_1340',['ConnectedComponentsAlgorithmsTypes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga5ed7784614678adccb699c70fb841075',1,'cv::ConnectedComponentsAlgorithmsTypes'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga5ed7784614678adccb699c70fb841075',1,'ConnectedComponentsAlgorithmsTypes(Global Namespace)']]], - ['connectedcomponentstypes_1341',['ConnectedComponentsTypes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gac7099124c0390051c6970a987e7dc5c5',1,'cv::ConnectedComponentsTypes'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gac7099124c0390051c6970a987e7dc5c5',1,'ConnectedComponentsTypes(Global Namespace)']]], - ['connectedcomponentswithstats_1342',['connectedComponentsWithStats',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga107a78bf7cd25dec05fb4dfc5c9e765f',1,'cv::connectedComponentsWithStats(InputArray image, OutputArray labels, OutputArray stats, OutputArray centroids, int connectivity, int ltype, int ccltype)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gae57b028a2b2ca327227c2399a9d53241',1,'cv::connectedComponentsWithStats(InputArray image, OutputArray labels, OutputArray stats, OutputArray centroids, int connectivity=8, int ltype=CV_32S)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga107a78bf7cd25dec05fb4dfc5c9e765f',1,'connectedComponentsWithStats(InputArray image, OutputArray labels, OutputArray stats, OutputArray centroids, int connectivity, int ltype, int ccltype)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gae57b028a2b2ca327227c2399a9d53241',1,'connectedComponentsWithStats(InputArray image, OutputArray labels, OutputArray stats, OutputArray centroids, int connectivity=8, int ltype=CV_32S)(Global Namespace)']]], - ['connectedges_1343',['connectEdges',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a3490a3d952aa7ef951a3bdb9bce3688c',1,'cv::Subdiv2D']]], - ['connections_20with_20c_1344',['Connections with C++',['https://docs.opencv.org/4.2.0/d8/dd7/group__core__c__glue.html',1,'']]], - ['connectivitymask_1345',['connectivityMask',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga9cd8a37566d3c2f2bdd83f14eb96a57d',1,'cv::cuda::connectivityMask()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga9cd8a37566d3c2f2bdd83f14eb96a57d',1,'connectivityMask()(Global Namespace)']]], - ['conservativeresize_1346',['conservativeResize',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'Eigen::PlainObjectBase::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'Eigen::PlainObjectBase::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'Eigen::PlainObjectBase::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'Eigen::PlainObjectBase::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9dc538b2c1fe9027ba58f31ee83b2ff1',1,'Eigen::SparseMatrix::conservativeResize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9dc538b2c1fe9027ba58f31ee83b2ff1',1,'SparseMatrix< Scalar >::conservativeResize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9dc538b2c1fe9027ba58f31ee83b2ff1',1,'SparseMatrix< Scalar, ColMajor, int >::conservativeResize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9dc538b2c1fe9027ba58f31ee83b2ff1',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::conservativeResize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9dc538b2c1fe9027ba58f31ee83b2ff1',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::conservativeResize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#abc6d75178a429bfddd4ca4a36261f213',1,'Eigen::SparseVector::conservativeResize()']]], - ['conservativeresizelike_1347',['conservativeResizeLike',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'Eigen::PlainObjectBase::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()']]], - ['consistentmosaicinpainter_1348',['ConsistentMosaicInpainter',['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1videostab_1_1ConsistentMosaicInpainter.html',1,'cv::videostab::ConsistentMosaicInpainter'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1videostab_1_1ConsistentMosaicInpainter.html#ab630d4502bf586264ec21ee342e04fa1',1,'cv::videostab::ConsistentMosaicInpainter::ConsistentMosaicInpainter()']]], - ['const_20propagating_20wrapper_1349',['Const-propagating wrapper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01526.html',1,'']]], - ['const_5finputs_1350',['const_inputs',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#abcd569505d17ebb8d373458e689b2d4d',1,'cv::gapi::ie::detail::ParamDesc']]], - ['const_5fiterator_1351',['const_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11931.html',1,'__gnu_pbds::detail::pat_trie_base::_Inode< _ATraits, Metadata >::const_iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a03ee12b0c549bc13394a274a18bd891e',1,'cv::Mat_::const_iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a03ee12b0c549bc13394a274a18bd891e',1,'Mat_< double >::const_iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a03ee12b0c549bc13394a274a18bd891e',1,'Mat_< float >::const_iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a03ee12b0c549bc13394a274a18bd891e',1,'Mat_< uchar >::const_iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a03ee12b0c549bc13394a274a18bd891e',1,'Mat_< unsigned char >::const_iterator'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a4f7803d5c41eef808081903167d3a263',1,'cv::SparseMat::const_iterator'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a60cda480e8a3854c706d9f56a119c8fd',1,'cv::SparseMat_::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11363.html#aa520fee6d39690828c3ea6cf7142030d',1,'__gnu_pbds::trie_string_access_traits::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3d51d0ac851fe6c1b5d59e3b5aacfe57',1,'std::set::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3d51d0ac851fe6c1b5d59e3b5aacfe57',1,'std::set::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acb0e1b9ce26687d13dace99250f876e3',1,'std::unordered_map::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acb0e1b9ce26687d13dace99250f876e3',1,'std::unordered_map::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac98a77485a1a68eaadb6a7c8b5d4b141',1,'std::unordered_multimap::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac98a77485a1a68eaadb6a7c8b5d4b141',1,'std::unordered_multimap::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a348726f7f2783583fee4bccee78e6ff4',1,'std::unordered_multiset::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a348726f7f2783583fee4bccee78e6ff4',1,'std::unordered_multiset::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a77ac106cb24d3c809aa1dac59b508f46',1,'std::unordered_set::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a77ac106cb24d3c809aa1dac59b508f46',1,'std::unordered_set::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acb0e1b9ce26687d13dace99250f876e3',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acb0e1b9ce26687d13dace99250f876e3',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a306d9418d4b34874e9005d961c490cd2',1,'Eigen::DenseBase::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a306d9418d4b34874e9005d961c490cd2',1,'DenseBase< ArrayWrapper< ExpressionType > >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a306d9418d4b34874e9005d961c490cd2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a306d9418d4b34874e9005d961c490cd2',1,'DenseBase< Solve< Decomposition, RhsType > >::const_iterator'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aebd2cfa7e4ded4e97cde9269bfeeea38.html#aebd2cfa7e4ded4e97cde9269bfeeea38',1,'nlohmann::basic_json::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'Eigen::VectorwiseOp::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const Derived, Horizontal >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const Derived, Vertical >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::const_iterator']]], - ['const_5fiterator_5f_1352',['const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html',1,'const_iterator_'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#a7d6dec5709f9fa70583f65263701e9a3',1,'const_iterator_::const_iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#aefd4394ed84e098841202e80ebbd7b8b',1,'const_iterator_::const_iterator_(const_pointer_ p_value, PB_DS_GEN_POS pos, const PB_DS_CLASS_C_DEC *p_tbl)']]], - ['const_5flocal_5fiterator_1353',['const_local_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af0cb2cf999f96def015e87c3cca6691d',1,'std::unordered_map::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af0cb2cf999f96def015e87c3cca6691d',1,'std::unordered_map::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ab04f4d4643b5de9638d2f5aaa31d94e5',1,'std::unordered_multimap::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ab04f4d4643b5de9638d2f5aaa31d94e5',1,'std::unordered_multimap::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af3443472eeb3187e370e7c523c5df91e',1,'std::unordered_multiset::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af3443472eeb3187e370e7c523c5df91e',1,'std::unordered_multiset::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ad71108e3e7466e69cf84def961574aec',1,'std::unordered_set::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ad71108e3e7466e69cf84def961574aec',1,'std::unordered_set::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af0cb2cf999f96def015e87c3cca6691d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af0cb2cf999f96def015e87c3cca6691d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_local_iterator']]], - ['const_5fmem_5ffun1_5fref_5ft_1354',['const_mem_fun1_ref_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07647.html',1,'std']]], - ['const_5fmem_5ffun1_5ft_1355',['const_mem_fun1_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07639.html',1,'std']]], - ['const_5fmem_5ffun_5fref_5ft_1356',['const_mem_fun_ref_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07631.html',1,'std']]], - ['const_5fmem_5ffun_5ft_1357',['const_mem_fun_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07623.html',1,'std']]], - ['const_5fparam_5ftype_1358',['const_param_type',['https://docs.opencv.org/4.2.0/db/d0d/structcv_1_1ParamType_3_01__Tp_00_01typename_01std_1_1enable__if_3_01std_1_1is__enum_3_01__Tp_01_4_1_1value_01_4_1_1type_01_4.html#a0205eb16a28e784575cfde165f2b22ec',1,'cv::ParamType< _Tp, typename std::enable_if< std::is_enum< _Tp >::value >::type >::const_param_type'],['https://docs.opencv.org/4.2.0/d2/d39/structcv_1_1ParamType_3_01Algorithm_01_4.html#ad5a747dbd46d3d89333446fb44a11622',1,'cv::ParamType< Algorithm >::const_param_type'],['https://docs.opencv.org/4.2.0/d1/d87/structcv_1_1ParamType_3_01bool_01_4.html#a7dfbf4986b3baa8c885d1f4f9f9faa68',1,'cv::ParamType< bool >::const_param_type'],['https://docs.opencv.org/4.2.0/d4/d98/structcv_1_1ParamType_3_01double_01_4.html#af89d2dea03d58c74da4d325567e18d10',1,'cv::ParamType< double >::const_param_type'],['https://docs.opencv.org/4.2.0/dd/df2/structcv_1_1ParamType_3_01float_01_4.html#a036d463bd35228bcd55e404a19137968',1,'cv::ParamType< float >::const_param_type'],['https://docs.opencv.org/4.2.0/db/d5f/structcv_1_1ParamType_3_01Mat_01_4.html#acff1d3691c6eb064470617deb75c57e6',1,'cv::ParamType< Mat >::const_param_type'],['https://docs.opencv.org/4.2.0/d2/dda/structcv_1_1ParamType_3_01Scalar_01_4.html#a7c28a3c306ab486360b8b77398eede0c',1,'cv::ParamType< Scalar >::const_param_type'],['https://docs.opencv.org/4.2.0/dc/d1c/structcv_1_1ParamType_3_01std_1_1vector_3_01Mat_01_4_01_4.html#ab6003f7118e8f4a0fe9b82b1726547fd',1,'cv::ParamType< std::vector< Mat > >::const_param_type'],['https://docs.opencv.org/4.2.0/d0/d5f/structcv_1_1ParamType_3_01String_01_4.html#a08d838030dee6f2ffa9bcc8548514f55',1,'cv::ParamType< String >::const_param_type'],['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1ParamType_3_01uchar_01_4.html#ad5c9489f1317cc5c418a9a7b17474c21',1,'cv::ParamType< uchar >::const_param_type'],['https://docs.opencv.org/4.2.0/dc/d63/structcv_1_1ParamType_3_01uint64_01_4.html#aca86b26f06acb9d3653fa2d994a6b216',1,'cv::ParamType< uint64 >::const_param_type'],['https://docs.opencv.org/4.2.0/d7/d68/structcv_1_1ParamType_3_01unsigned_01_4.html#afe2f0ffe1293d36ed5ef2a9a535a154c',1,'cv::ParamType< unsigned >::const_param_type']]], - ['const_5fpointer_1359',['const_pointer',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a91b3cfd49759f29223b558b50fb338ba',1,'cv::Allocator::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#a8233f5369e1b6e60da547f7f1843e030',1,'__gnu_pbds::detail::binary_heap_const_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#abc8067c1b2d82a54c6836768b76f0383',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#a162def37be44e8be8c4a67ae92e99e4e',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#acd2508c18e3fd2bf7bee7f9614412b35',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a841791873537638dfc36c80ecc98bc48',1,'allocator_traits< _Tp_alloc_type >::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#a56f3879fa29a0681a004a855e77bb8e7',1,'const_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a5b919c25bd3e9c458e1023bb775c41e4',1,'iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5c4301fb32288fe246e53a9712ccdfd9',1,'point_const_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a89be73f6a8053c3a8a467f9e5b9a381c',1,'point_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a841791873537638dfc36c80ecc98bc48',1,'std::allocator_traits::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a96c1831e637b76322672ada286c11295',1,'std::allocator_traits< allocator< _Tp > >::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3d7226decb850440d394df1dafae0984',1,'std::set::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3d7226decb850440d394df1dafae0984',1,'std::set::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a16fbc4a1f8abfebdee17e4d6303c03a3',1,'std::unordered_map::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a16fbc4a1f8abfebdee17e4d6303c03a3',1,'std::unordered_map::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac2aca480ec930cab8cee31638ec6aa0c',1,'std::unordered_multimap::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac2aca480ec930cab8cee31638ec6aa0c',1,'std::unordered_multimap::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aa107c9adeffdf499edd13a0a88ed8cbc',1,'std::unordered_multiset::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aa107c9adeffdf499edd13a0a88ed8cbc',1,'std::unordered_multiset::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a64c2420ac682e15e195863aecf2bcb8b',1,'std::unordered_set::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a64c2420ac682e15e195863aecf2bcb8b',1,'std::unordered_set::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a16fbc4a1f8abfebdee17e4d6303c03a3',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a16fbc4a1f8abfebdee17e4d6303c03a3',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_pointer'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4108c5148f1d7cf13c2681e22f141a10.html#a4108c5148f1d7cf13c2681e22f141a10',1,'nlohmann::basic_json::const_pointer']]], - ['const_5fpointer_5fcast_1360',['const_pointer_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa2f97c555285b7c2e771b789ccd7b126',1,'std']]], - ['const_5freference_1361',['const_reference',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a3fdc48a7fe0d17cc5807500be535c150',1,'cv::Allocator::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7c469cca98a372efbd8ed9cb086fa3ae',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11631.html#a4929c6c309b332e7e61ca667d4970f34',1,'__gnu_pbds::detail::bin_search_tree_node_it_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#a157eb231eb4380523a8b4f619829787e',1,'__gnu_pbds::detail::binary_heap_const_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#ac229bf024f7824ff3c9b29333d3e2dd9',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#a21dc840b511d19faf16ba33864df72df',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a1c27f284ce4ba239912eb348bebff5c3',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#ace57cd6add9d3c9d22db7e8903ed2788',1,'const_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a6697087226a2ded72ae3aa5448c4a330',1,'iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#ae2a78ffde6504713d18b10737b777aea',1,'point_const_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a05924e3a0a7e273dcea7afecfb20dbd6',1,'point_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a8d75c5991f7b0318f9390ed0a960a805',1,'std::set::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a8d75c5991f7b0318f9390ed0a960a805',1,'std::set::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aaa3ed5ea37fb02cd6a5eacf89409f52d',1,'std::unordered_map::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aaa3ed5ea37fb02cd6a5eacf89409f52d',1,'std::unordered_map::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a580c722f453604f50c163788a75fd6c3',1,'std::unordered_multimap::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a580c722f453604f50c163788a75fd6c3',1,'std::unordered_multimap::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ab16debc24d07c39201f4aaa943b8ba6d',1,'std::unordered_multiset::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ab16debc24d07c39201f4aaa943b8ba6d',1,'std::unordered_multiset::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a795d0f609bd9032858d61acc386ee11a',1,'std::unordered_set::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a795d0f609bd9032858d61acc386ee11a',1,'std::unordered_set::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aaa3ed5ea37fb02cd6a5eacf89409f52d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aaa3ed5ea37fb02cd6a5eacf89409f52d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_reference'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab8a1c33ee7b154fc41ca2545aa9724e6.html#ab8a1c33ee7b154fc41ca2545aa9724e6',1,'nlohmann::basic_json::const_reference']]], - ['const_5freverse_5fiterator_1362',['const_reverse_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab28676718c0dc84a292b8998fa943c83',1,'std::set::const_reverse_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab28676718c0dc84a292b8998fa943c83',1,'std::set::const_reverse_iterator'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa7dba16ed9ee97380aeb17a207dd919a.html#aa7dba16ed9ee97380aeb17a207dd919a',1,'nlohmann::basic_json::const_reverse_iterator']]], - ['const_5fvoid_5fpointer_1363',['const_void_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a5a9cb47519e4840523e38e45cf56bf1d',1,'__alloc_traits< _Tp_alloc_type >::const_void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a5a9cb47519e4840523e38e45cf56bf1d',1,'__gnu_cxx::__alloc_traits::const_void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a5a9cb47519e4840523e38e45cf56bf1d',1,'allocator_traits< _Tp_alloc_type >::const_void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a5a9cb47519e4840523e38e45cf56bf1d',1,'std::allocator_traits::const_void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#aa47f11fc58f578103d6d7eb28e2fab5c',1,'std::allocator_traits< allocator< _Tp > >::const_void_pointer']]], - ['constaffinepart_1364',['ConstAffinePart',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#adfa0bf2d9504548cdc9b9051b2fa9673',1,'Eigen::Transform']]], - ['constant_1365',['Constant',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#aa91553f34d69e1c969e2e9fab0beb08f',1,'cv::ocl::KernelArg::Constant(const Mat &m)'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a357cca635048b2a6e2606f07d30efd31',1,'cv::ocl::KernelArg::Constant(const _Tp *arr, size_t n)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aed89b5cc6e3b7d9d5bd63aed245ccd6d',1,'Eigen::DenseBase::Constant(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a68a7ece6c5629d1e9447a321fcb14ccd',1,'Eigen::DenseBase::Constant(Index rows, Index cols, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1fdd3189ae3a41d250593334d82210cf',1,'Eigen::DenseBase::Constant(Index size, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aed89b5cc6e3b7d9d5bd63aed245ccd6d',1,'DenseBase< ArrayWrapper< ExpressionType > >::Constant(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a68a7ece6c5629d1e9447a321fcb14ccd',1,'DenseBase< ArrayWrapper< ExpressionType > >::Constant(Index rows, Index cols, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1fdd3189ae3a41d250593334d82210cf',1,'DenseBase< ArrayWrapper< ExpressionType > >::Constant(Index size, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aed89b5cc6e3b7d9d5bd63aed245ccd6d',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Constant(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a68a7ece6c5629d1e9447a321fcb14ccd',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Constant(Index rows, Index cols, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1fdd3189ae3a41d250593334d82210cf',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Constant(Index size, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aed89b5cc6e3b7d9d5bd63aed245ccd6d',1,'DenseBase< Solve< Decomposition, RhsType > >::Constant(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a68a7ece6c5629d1e9447a321fcb14ccd',1,'DenseBase< Solve< Decomposition, RhsType > >::Constant(Index rows, Index cols, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1fdd3189ae3a41d250593334d82210cf',1,'DenseBase< Solve< Decomposition, RhsType > >::Constant(Index size, const Scalar &value)']]], - ['constant_1366',['CONSTANT',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a1010adb068498c191b8079323ad790f9a70a1b962f26e257cbb8715653897e20c',1,'cv::ocl::KernelArg']]], - ['constant_2ehpp_1367',['constant.hpp',['https://docs.opencv.org/4.2.0/d8/dbf/constant_8hpp.html',1,'']]], - ['constant0_1368',['constant0',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gabbe0a1fe70c819c69c49791fd172bbb7',1,'__gnu_cxx::constant0()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gabbe0a1fe70c819c69c49791fd172bbb7',1,'constant0()(Global Namespace)']]], - ['constant1_1369',['constant1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga00aba91be56a04a7a200f932b507c4f2',1,'__gnu_cxx::constant1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga00aba91be56a04a7a200f932b507c4f2',1,'constant1()(Global Namespace)']]], - ['constant2_1370',['constant2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gafa3404bd6e935274a6ce879dab3c8d08',1,'__gnu_cxx::constant2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gafa3404bd6e935274a6ce879dab3c8d08',1,'constant2()(Global Namespace)']]], - ['constant_5fbinary_5ffun_1371',['constant_binary_fun',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09215.html',1,'__gnu_cxx']]], - ['constant_5fsize_5fblocks_5ftag_1372',['constant_size_blocks_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09767.html',1,'__gnu_parallel']]], - ['constant_5funary_5ffun_1373',['constant_unary_fun',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09211.html',1,'__gnu_cxx']]], - ['constant_5fvoid_5ffun_1374',['constant_void_fun',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09207.html',1,'__gnu_cxx']]], - ['constantptr_1375',['ConstantPtr',['https://docs.opencv.org/4.2.0/d5/db7/structcv_1_1cudev_1_1ConstantPtr.html',1,'cv::cudev']]], - ['constantptr_1376',['constantPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b2ac61efab2ed96241275b822c57990',1,'cv::cudev::constantPtr(T value)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac972334035abee982d93c8d981ef7d31',1,'cv::cudev::constantPtr(T value, int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b2ac61efab2ed96241275b822c57990',1,'constantPtr(T value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac972334035abee982d93c8d981ef7d31',1,'constantPtr(T value, int rows, int cols)(Global Namespace)']]], - ['constantptrsz_1377',['ConstantPtrSz',['https://docs.opencv.org/4.2.0/d2/df7/structcv_1_1cudev_1_1ConstantPtrSz.html',1,'cv::cudev']]], - ['constinput_1378',['ConstInput',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#a973fed5585bc862a96339cf10f632bbb',1,'cv::gapi::ie::detail::ParamDesc']]], - ['constinput_1379',['constInput',['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#a9e18d44a58c68488dcc0cfb58543f8d7',1,'cv::gapi::ie::Params']]], - ['constlayer_1380',['ConstLayer',['https://docs.opencv.org/4.2.0/de/dff/classcv_1_1dnn_1_1ConstLayer.html',1,'cv::dnn']]], - ['constlinearpart_1381',['ConstLinearPart',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ab09f89e930e9c96e64253b4d2d9f0f36',1,'Eigen::Transform']]], - ['constmatrixtype_1382',['ConstMatrixType',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a16a3127612714bbf4edd7c2d93a8cc6b',1,'Eigen::Transform']]], - ['construct_1383',['construct',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#aaa6a7abde8485e155c045ffade9b1f84',1,'cv::Allocator::construct()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#ad96be4073167053157b3c54782457a6e',1,'__alloc_traits< _Tp_alloc_type >::construct(_Tp_alloc_type &__a, _Tp *__p, _Args &&... __args) noexcept(noexcept(_S_construct(__a, __p, std::forward< _Args >(__args)...))) -> decltype(_S_construct(__a, __p, std::forward< _Args >(__args)...))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ad96be4073167053157b3c54782457a6e',1,'__alloc_traits< _Tp_alloc_type >::construct(_Tp_alloc_type &__a, _Tp *__p, _Args &&... __args) noexcept(noexcept(_S_construct(__a, __p, std::forward< _Args >(__args)...))) -> decltype(_S_construct(__a, __p, std::forward< _Args >(__args)...))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#ad96be4073167053157b3c54782457a6e',1,'__gnu_cxx::__alloc_traits::construct(_Alloc &__a, _Tp *__p, _Args &&... __args) noexcept(noexcept(_S_construct(__a, __p, std::forward< _Args >(__args)...))) -> decltype(_S_construct(__a, __p, std::forward< _Args >(__args)...))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ad96be4073167053157b3c54782457a6e',1,'__gnu_cxx::__alloc_traits::construct(_Alloc &__a, _Tp *__p, _Args &&... __args) noexcept(noexcept(_S_construct(__a, __p, std::forward< _Args >(__args)...))) -> decltype(_S_construct(__a, __p, std::forward< _Args >(__args)...))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ad96be4073167053157b3c54782457a6e',1,'allocator_traits< _Tp_alloc_type >::construct()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ad96be4073167053157b3c54782457a6e',1,'std::allocator_traits::construct()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#aa62d702c78bb5d61c52662d227cfa647',1,'std::allocator_traits< allocator< _Tp > >::construct()']]], - ['constructor_1384',['Constructor',['https://docs.opencv.org/4.2.0/d4/d67/classcv_1_1dnn_1_1LayerFactory.html#a5a9145f3c87e3f42aa74bef2b2585fa8',1,'cv::dnn::LayerFactory']]], - ['constructvec_1385',['ConstructVec',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#aab15620c1bd731b84ed025416dbb5cf1',1,'cv::detail']]], - ['constructvelcontroller_1386',['constructVelController',['../classrobot_1_1base__motor.html#a82a29b47dc89943ca11d6455c3d43130',1,'robot::base_motor']]], - ['consttranslationpart_1387',['ConstTranslationPart',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a33ea3bc20d89eda7e642a8f3d728bf17',1,'Eigen::Transform']]], - ['container_1388',['Container',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a0cabe346c38a4f1ab1b8a396fbd2bbe2.html#a0cabe346c38a4f1ab1b8a396fbd2bbe2',1,'nlohmann::ordered_map::Container'],['https://docs.opencv.org/4.2.0/d6/d6d/tutorial_mat_the_basic_image_container.html',1,'Mat - The Basic Image Container']]], - ['container_20of_20any_20type_1389',['Type-safe container of any type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html',1,'']]], - ['container_5favi_2eprivate_2ehpp_1390',['container_avi.private.hpp',['https://docs.opencv.org/4.2.0/d2/db0/container__avi_8private_8hpp.html',1,'']]], - ['container_5fbase_5fdispatch_1391',['container_base_dispatch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11355.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_2ehpp_1392',['container_base_dispatch.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01142.html',1,'']]], - ['container_5fbase_5fdispatch_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20binary_5fheap_5ftag_2c_20null_5ftype_20_3e_1393',['container_base_dispatch< _VTp, Cmp_Fn, _Alloc, binary_heap_tag, null_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11447.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20binomial_5fheap_5ftag_2c_20null_5ftype_20_3e_1394',['container_base_dispatch< _VTp, Cmp_Fn, _Alloc, binomial_heap_tag, null_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11439.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20pairing_5fheap_5ftag_2c_20null_5ftype_20_3e_1395',['container_base_dispatch< _VTp, Cmp_Fn, _Alloc, pairing_heap_tag, null_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11435.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20rc_5fbinomial_5fheap_5ftag_2c_20null_5ftype_20_3e_1396',['container_base_dispatch< _VTp, Cmp_Fn, _Alloc, rc_binomial_heap_tag, null_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11443.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20thin_5fheap_5ftag_2c_20null_5ftype_20_3e_1397',['container_base_dispatch< _VTp, Cmp_Fn, _Alloc, thin_heap_tag, null_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11451.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20cc_5fhash_5ftag_2c_20policy_5ftl_20_3e_1398',['container_base_dispatch< Key, Mapped, _Alloc, cc_hash_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11419.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20gp_5fhash_5ftag_2c_20policy_5ftl_20_3e_1399',['container_base_dispatch< Key, Mapped, _Alloc, gp_hash_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11427.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20list_5fupdate_5ftag_2c_20policy_5ftl_20_3e_1400',['container_base_dispatch< Key, Mapped, _Alloc, list_update_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11379.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20ov_5ftree_5ftag_2c_20policy_5ftl_20_3e_1401',['container_base_dispatch< Key, Mapped, _Alloc, ov_tree_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11411.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20pat_5ftrie_5ftag_2c_20policy_5ftl_20_3e_1402',['container_base_dispatch< Key, Mapped, _Alloc, pat_trie_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11387.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20rb_5ftree_5ftag_2c_20policy_5ftl_20_3e_1403',['container_base_dispatch< Key, Mapped, _Alloc, rb_tree_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11395.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20splay_5ftree_5ftag_2c_20policy_5ftl_20_3e_1404',['container_base_dispatch< Key, Mapped, _Alloc, splay_tree_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11403.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20cc_5fhash_5ftag_2c_20policy_5ftl_20_3e_1405',['container_base_dispatch< Key, null_type, _Alloc, cc_hash_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11423.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20gp_5fhash_5ftag_2c_20policy_5ftl_20_3e_1406',['container_base_dispatch< Key, null_type, _Alloc, gp_hash_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11431.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20list_5fupdate_5ftag_2c_20policy_5ftl_20_3e_1407',['container_base_dispatch< Key, null_type, _Alloc, list_update_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11383.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20ov_5ftree_5ftag_2c_20policy_5ftl_20_3e_1408',['container_base_dispatch< Key, null_type, _Alloc, ov_tree_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11415.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20pat_5ftrie_5ftag_2c_20policy_5ftl_20_3e_1409',['container_base_dispatch< Key, null_type, _Alloc, pat_trie_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11391.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20rb_5ftree_5ftag_2c_20policy_5ftl_20_3e_1410',['container_base_dispatch< Key, null_type, _Alloc, rb_tree_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11399.html',1,'__gnu_pbds::detail']]], - ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20splay_5ftree_5ftag_2c_20policy_5ftl_20_3e_1411',['container_base_dispatch< Key, null_type, _Alloc, splay_tree_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11407.html',1,'__gnu_pbds::detail']]], - ['container_5ferror_1412',['container_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11127.html',1,'__gnu_pbds']]], - ['container_5ftag_1413',['container_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11207.html',1,'__gnu_pbds']]], - ['container_5ftraits_1414',['container_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_1415',['container_traits_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11299.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_3c_20binary_5fheap_5ftag_20_3e_1416',['container_traits_base< binary_heap_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11347.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_3c_20binomial_5fheap_5ftag_20_3e_1417',['container_traits_base< binomial_heap_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11339.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_3c_20cc_5fhash_5ftag_20_3e_1418',['container_traits_base< cc_hash_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11303.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_3c_20cntnr_3a_3acontainer_5fcategory_20_3e_1419',['container_traits_base< Cntnr::container_category >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11299.html',1,'']]], - ['container_5ftraits_5fbase_3c_20gp_5fhash_5ftag_20_3e_1420',['container_traits_base< gp_hash_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11307.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_3c_20list_5fupdate_5ftag_20_3e_1421',['container_traits_base< list_update_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11327.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_3c_20ov_5ftree_5ftag_20_3e_1422',['container_traits_base< ov_tree_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11319.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_3c_20pairing_5fheap_5ftag_20_3e_1423',['container_traits_base< pairing_heap_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11331.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_3c_20pat_5ftrie_5ftag_20_3e_1424',['container_traits_base< pat_trie_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11323.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_3c_20rb_5ftree_5ftag_20_3e_1425',['container_traits_base< rb_tree_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11311.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_3c_20rc_5fbinomial_5fheap_5ftag_20_3e_1426',['container_traits_base< rc_binomial_heap_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11343.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_3c_20splay_5ftree_5ftag_20_3e_1427',['container_traits_base< splay_tree_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11315.html',1,'__gnu_pbds']]], - ['container_5ftraits_5fbase_3c_20thin_5fheap_5ftag_20_3e_1428',['container_traits_base< thin_heap_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11335.html',1,'__gnu_pbds']]], - ['container_5ftype_1429',['container_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#a07b20b41619db738d2bb3782b063be1a',1,'std::back_insert_iterator::container_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#a4308a2935935721e29e7cd725be64007',1,'std::front_insert_iterator::container_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a81ef704d3e33bcb38d894a8b1e440771',1,'std::insert_iterator::container_type'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a4d27e8633c5a5e3b49dd4ccb06515713.html#a4d27e8633c5a5e3b49dd4ccb06515713',1,'nlohmann::byte_container_with_subtype::container_type']]], - ['containers_1430',['Containers',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01469.html',1,'Containers'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01527.html',1,'Containers']]], - ['containers_20with_20eigen_1431',['Using STL Containers with Eigen',['https://eigen.tuxfamily.org/dox/group__TopicStlContainers.html',1,'']]], - ['contains_1432',['contains',['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a367d5be1a40cc9d423f765ebf2721ee8',1,'cv::Rect_::contains()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a013a78bb0e9ac3a27dc1e604435288fb',1,'Eigen::AlignedBox::contains(const AlignedBox &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a8bfd8127621e4a19032945744adf5041',1,'Eigen::AlignedBox::contains(const MatrixBase< Derived > &p) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a02c9bc4d0f33b7dec20b2798301d6971.html#a02c9bc4d0f33b7dec20b2798301d6971',1,'nlohmann::basic_json::contains(KeyT &&key) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_adb82c1f34c73486e013da71ae369e597.html#adb82c1f34c73486e013da71ae369e597',1,'nlohmann::basic_json::contains(const json_pointer &ptr) const']]], - ['context_1433',['Context',['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html',1,'cv::ocl::Context'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a2474d50e89eef07e34e82bcb5067ca8a',1,'cv::ocl::Context::Context()'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a1db64b0cb4055c0a3fbeb51fd8682bfa',1,'cv::ocl::Context::Context(int dtype)'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a2f80a4600f75bb25b511e196c331b746',1,'cv::ocl::Context::Context(const Context &c)']]], - ['contextenergy_5fspatialconstant_1434',['contextEnergy_spatialConstant',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#a21d451433f4ef6425cae730e3284c93c',1,'cv::bioinspired::SegmentationParameters']]], - ['contextenergy_5ftemporalconstant_1435',['contextEnergy_temporalConstant',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#a223120f1456f0dbbb8481653d557af1e',1,'cv::bioinspired::SegmentationParameters']]], - ['continuous_5fflag_1436',['CONTINUOUS_FLAG',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ac0da3ccbc32a8894fc03afb9cea40150a3a50403178ba15a9617f5ff341418cf9',1,'cv::Mat::CONTINUOUS_FLAG'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#abf9262de727fd7542c5bead234fc41cea84000db2750cd83ad01c344b8a5b896e',1,'cv::UMat::CONTINUOUS_FLAG']]], - ['continuoustodiscrete_1437',['continuousToDiscrete',['../namespacefilters_1_1statespace.html#adde11abc1234c3e46a3b37962e9f89c8',1,'filters::statespace']]], - ['contour_20features_1438',['Contour Features',['https://docs.opencv.org/4.2.0/dd/d49/tutorial_py_contour_features.html',1,'Contour Features'],['https://docs.opencv.org/4.2.0/dc/dcf/tutorial_js_contour_features.html',1,'Contour Features']]], - ['contour_20properties_1439',['Contour Properties',['https://docs.opencv.org/4.2.0/d1/d32/tutorial_py_contour_properties.html',1,'Contour Properties'],['https://docs.opencv.org/4.2.0/da/dc1/tutorial_js_contour_properties.html',1,'Contour Properties']]], - ['contourapproximationmodes_1440',['ContourApproximationModes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga4303f45752694956374734a03c54d5ff',1,'cv::ContourApproximationModes'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga4303f45752694956374734a03c54d5ff',1,'ContourApproximationModes(Global Namespace)']]], - ['contourarea_1441',['contourArea',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga2c759ed9f497d4a618048a2f56dc97f1',1,'cv::contourArea()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga2c759ed9f497d4a618048a2f56dc97f1',1,'contourArea()(Global Namespace)']]], - ['contourfitting_1442',['ContourFitting',['https://docs.opencv.org/4.2.0/d5/d72/classcv_1_1ximgproc_1_1ContourFitting.html',1,'cv::ximgproc::ContourFitting'],['https://docs.opencv.org/4.2.0/d5/d72/classcv_1_1ximgproc_1_1ContourFitting.html#a5e4d25365e3033d2d8113a6e1a2c2db1',1,'cv::ximgproc::ContourFitting::ContourFitting()']]], - ['contours_1443',['contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'Creating Bounding boxes and circles for contours'],['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'Creating Bounding rotated boxes and ellipses for contours']]], - ['contours_20_3a_20getting_20started_1444',['Contours : Getting Started',['https://docs.opencv.org/4.2.0/d4/d73/tutorial_py_contours_begin.html',1,'Contours : Getting Started'],['https://docs.opencv.org/4.2.0/d5/daa/tutorial_js_contours_begin.html',1,'Contours : Getting Started']]], - ['contours_20_3a_20more_20functions_1445',['Contours : More Functions',['https://docs.opencv.org/4.2.0/d5/d45/tutorial_py_contours_more_functions.html',1,'Contours : More Functions'],['https://docs.opencv.org/4.2.0/d8/d1c/tutorial_js_contours_more_functions.html',1,'Contours : More Functions']]], - ['contours_20hierarchy_1446',['Contours Hierarchy',['https://docs.opencv.org/4.2.0/d9/d8b/tutorial_py_contours_hierarchy.html',1,'Contours Hierarchy'],['https://docs.opencv.org/4.2.0/da/d0a/tutorial_js_contours_hierarchy.html',1,'Contours Hierarchy']]], - ['contours_20in_20opencv_1447',['Contours in OpenCV',['https://docs.opencv.org/4.2.0/d3/d05/tutorial_py_table_of_contents_contours.html',1,'']]], - ['contours_20in_20opencv_20js_1448',['Contours in OpenCV.js',['https://docs.opencv.org/4.2.0/d0/d43/tutorial_js_table_of_contents_contours.html',1,'']]], - ['contours_20in_20your_20image_1449',['Finding contours in your image',['https://docs.opencv.org/4.2.0/df/d0d/tutorial_find_contours.html',1,'']]], - ['contours_5fmatch_5fi1_1450',['CONTOURS_MATCH_I1',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaf2b97a230b51856d09a2d934b78c015fa73b8cbe851905080a1d918c902253dcc',1,'cv::CONTOURS_MATCH_I1'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaf2b97a230b51856d09a2d934b78c015fa73b8cbe851905080a1d918c902253dcc',1,'CONTOURS_MATCH_I1(Global Namespace)']]], - ['contours_5fmatch_5fi2_1451',['CONTOURS_MATCH_I2',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaf2b97a230b51856d09a2d934b78c015faf511a9b06dc4776cc1ea1afe0fd5e7c1',1,'cv::CONTOURS_MATCH_I2'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaf2b97a230b51856d09a2d934b78c015faf511a9b06dc4776cc1ea1afe0fd5e7c1',1,'CONTOURS_MATCH_I2(Global Namespace)']]], - ['contours_5fmatch_5fi3_1452',['CONTOURS_MATCH_I3',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaf2b97a230b51856d09a2d934b78c015fae704cd6566d3576e6083657a8ac0792a',1,'cv::CONTOURS_MATCH_I3'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaf2b97a230b51856d09a2d934b78c015fae704cd6566d3576e6083657a8ac0792a',1,'CONTOURS_MATCH_I3(Global Namespace)']]], - ['contoursampling_1453',['contourSampling',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#ga7f51db9e952d4292a3b80bcc12b9fec9',1,'cv::ximgproc::contourSampling()'],['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#ga7f51db9e952d4292a3b80bcc12b9fec9',1,'contourSampling(InputArray src, OutputArray out, int nbElt)(Global Namespace)']]], - ['contrast_20and_20brightness_20of_20an_20image_1454',['Changing the contrast and brightness of an image!',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'']]], - ['contrast_20preserving_20decolorization_1455',['Contrast Preserving Decolorization',['https://docs.opencv.org/4.2.0/d4/d32/group__photo__decolor.html',1,'']]], - ['contrib_20modules_1456',['Tutorials for contrib modules',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_contrib_root.html',1,'']]], - ['contrib_5ftutorials_2emarkdown_1457',['contrib_tutorials.markdown',['https://docs.opencv.org/4.2.0/dd/df3/contrib__tutorials_8markdown.html',1,'']]], - ['controlmatrix_1458',['controlMatrix',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a6486e7287114810636fb33953280ed52',1,'cv::KalmanFilter']]], - ['conversions_1459',['Color conversions',['https://docs.opencv.org/4.2.0/de/d25/imgproc_color_conversions.html',1,'']]], - ['conversions_1460',['Color Space Conversions',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html',1,'']]], - ['convert_1461',['convert',['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a6bdc0b45d2a340a7a1dd8d6f9bce4bda',1,'cv::CascadeClassifier::convert()'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#aff325883052e446bb7a4cc85775beaa6',1,'cv::cuda::CascadeClassifier::convert()'],['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1cuda_1_1Feature2DAsync.html#a7d062860cbfaf1db00d1a42965b17324',1,'cv::cuda::Feature2DAsync::convert()'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#acfcc8e0dd1a634a7583686e18d372237',1,'cv::KeyPoint::convert(const std::vector< KeyPoint > &keypoints, std::vector< Point2f > &points2f, const std::vector< int > &keypointIndexes=std::vector< int >())'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#ab6a67a0ab17d65a1b28502eba424bfde',1,'cv::KeyPoint::convert(const std::vector< Point2f > &points2f, std::vector< KeyPoint > &keypoints, float size=1, float response=1, int octave=0, int class_id=-1)']]], - ['convert_2ehpp_1462',['convert.hpp',['https://docs.opencv.org/4.2.0/df/d32/convert_8hpp.html',1,'']]], - ['converted_1463',['converted',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a06c03e1e866769c8165776f85cc02fb7',1,'std::wstring_convert']]], - ['converters_1464',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], - ['convertfp16_1465',['convertFp16',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9c25d9ef44a2a48ecc3774b30cb80082',1,'cv::convertFp16()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gaa1c52258763197958eb9e6681917f723',1,'cv::cuda::convertFp16()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gaa1c52258763197958eb9e6681917f723',1,'convertFp16(InputArray _src, OutputArray _dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9c25d9ef44a2a48ecc3774b30cb80082',1,'convertFp16(InputArray src, OutputArray dst)(Global Namespace)']]], - ['convertfrombuffer_1466',['convertFromBuffer',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gaf7698360b08aa452c2692296ce55bccd',1,'cv::ocl::convertFromBuffer()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gaf7698360b08aa452c2692296ce55bccd',1,'convertFromBuffer()(Global Namespace)']]], - ['convertfromd3d10texture2d_1467',['convertFromD3D10Texture2D',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga46cdc3c6cc25fdef7321a923b040f046',1,'cv::directx::convertFromD3D10Texture2D()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga46cdc3c6cc25fdef7321a923b040f046',1,'convertFromD3D10Texture2D()(Global Namespace)']]], - ['convertfromd3d11texture2d_1468',['convertFromD3D11Texture2D',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#gaaea63f9b492b4a84e1e9ef6d4eba377c',1,'cv::directx::convertFromD3D11Texture2D()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#gaaea63f9b492b4a84e1e9ef6d4eba377c',1,'convertFromD3D11Texture2D()(Global Namespace)']]], - ['convertfromdirect3dsurface9_1469',['convertFromDirect3DSurface9',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga657f9cc740fe38fb0eb16df075224c2d',1,'cv::directx::convertFromDirect3DSurface9()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga657f9cc740fe38fb0eb16df075224c2d',1,'convertFromDirect3DSurface9()(Global Namespace)']]], - ['convertfromgltexture2d_1470',['convertFromGLTexture2D',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#gad2a559f1b93a89fa4936948f4c4c4bb2',1,'cv::ogl::convertFromGLTexture2D()'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#gad2a559f1b93a89fa4936948f4c4c4bb2',1,'convertFromGLTexture2D()(Global Namespace)']]], - ['convertfromimage_1471',['convertFromImage',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gada97cc08c31e416b957e23b480334b6c',1,'cv::ocl::convertFromImage()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gada97cc08c31e416b957e23b480334b6c',1,'convertFromImage()(Global Namespace)']]], - ['convertfromvasurface_1472',['convertFromVASurface',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html#ga6147e41eb1e1ab2631eeed53252c0735',1,'cv::va_intel::convertFromVASurface()'],['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html#ga6147e41eb1e1ab2631eeed53252c0735',1,'convertFromVASurface(VADisplay display, VASurfaceID surface, Size size, OutputArray dst)(Global Namespace)']]], - ['converting_20image_20from_20one_20color_20space_20to_20another_1473',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], - ['convertmaps_1474',['convertMaps',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga9156732fa8f01be9ebd1a194f2728b7f',1,'cv::convertMaps()'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga9156732fa8f01be9ebd1a194f2728b7f',1,'convertMaps()(Global Namespace)']]], - ['converto3dray_1475',['converTo3DRay',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a6a49dc343b4f85fa243d0888926b4f31',1,'cv::viz::Viz3d']]], - ['convertpointsfromhomogeneous_1476',['convertPointsFromHomogeneous',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gac42edda3a3a0f717979589fcd6ac0035',1,'cv::convertPointsFromHomogeneous()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gac42edda3a3a0f717979589fcd6ac0035',1,'convertPointsFromHomogeneous()(Global Namespace)']]], - ['convertpointshomogeneous_1477',['convertPointsHomogeneous',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gafa5aa3f40a472bda956b4c27bec67438',1,'cv::convertPointsHomogeneous()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gafa5aa3f40a472bda956b4c27bec67438',1,'convertPointsHomogeneous()(Global Namespace)']]], - ['convertpointstohomogeneous_1478',['convertPointsToHomogeneous',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga13159f129eec8a7d9bd8501f012d5543',1,'cv::convertPointsToHomogeneous()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga13159f129eec8a7d9bd8501f012d5543',1,'convertPointsToHomogeneous()(Global Namespace)']]], - ['convertscaleabs_1479',['convertScaleAbs',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3460e9c9f37b563ab9dd550c4d8c4e7d',1,'cv::convertScaleAbs()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3460e9c9f37b563ab9dd550c4d8c4e7d',1,'convertScaleAbs()(Global Namespace)']]], - ['convertto_1480',['convertTo',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a3a1b076e54d8a8503014e27a5440d98a',1,'cv::cuda::GpuMat::convertTo(OutputArray dst, int rtype) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a079d3d6541bb2fe6127c8f5d58953c9c',1,'cv::cuda::GpuMat::convertTo(OutputArray dst, int rtype, Stream &stream) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a656ac1f6a1426527f838c19e2d677dc0',1,'cv::cuda::GpuMat::convertTo(OutputArray dst, int rtype, double alpha, double beta=0.0) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a54f6bde0a55552bc80a48ecbc8e272d6',1,'cv::cuda::GpuMat::convertTo(OutputArray dst, int rtype, double alpha, Stream &stream) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a408e9ba5344ab7d3aa27323774de118e',1,'cv::cuda::GpuMat::convertTo(OutputArray dst, int rtype, double alpha, double beta, Stream &stream) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#adf88c60c5b4980e05bb556080916978b',1,'cv::Mat::convertTo()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a577ea9bbc02ffcf195df6d96f9c9650c',1,'cv::SparseMat::convertTo(SparseMat &m, int rtype, double alpha=1) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a668825b1d0bb87a075cc2382692093b7',1,'cv::SparseMat::convertTo(Mat &m, int rtype, double alpha=1, double beta=0) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a6f11287e53debd8d460fc053dc88feaa',1,'cv::UMat::convertTo()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gae972b2c91904d36e92ee14a6778db82e',1,'cv::gapi::convertTo()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gae972b2c91904d36e92ee14a6778db82e',1,'convertTo()(Global Namespace)']]], - ['converttod3d10texture2d_1481',['convertToD3D10Texture2D',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga96bb00cac7698f2fdb7001057f9e4352',1,'cv::directx::convertToD3D10Texture2D()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga96bb00cac7698f2fdb7001057f9e4352',1,'convertToD3D10Texture2D()(Global Namespace)']]], - ['converttod3d11texture2d_1482',['convertToD3D11Texture2D',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga92b6817beb98d9cdd71280420e3da8e3',1,'cv::directx::convertToD3D11Texture2D()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga92b6817beb98d9cdd71280420e3da8e3',1,'convertToD3D11Texture2D()(Global Namespace)']]], - ['converttodirect3dsurface9_1483',['convertToDirect3DSurface9',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga45c2557af043bc17b9491503fc669a2d',1,'cv::directx::convertToDirect3DSurface9()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga45c2557af043bc17b9491503fc669a2d',1,'convertToDirect3DSurface9()(Global Namespace)']]], - ['converttodmatches_1484',['convertToDMatches',['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a0752ace1e8e0c46af9531ffdda0b37ee',1,'cv::FlannBasedMatcher']]], - ['converttogltexture2d_1485',['convertToGLTexture2D',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga5ab4018bf271aecf8b7144e46ff363e9',1,'cv::ogl::convertToGLTexture2D()'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga5ab4018bf271aecf8b7144e46ff363e9',1,'convertToGLTexture2D()(Global Namespace)']]], - ['converttovasurface_1486',['convertToVASurface',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html#ga870965de4f91f2b054c6f974c65faa66',1,'cv::va_intel::convertToVASurface()'],['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html#ga870965de4f91f2b054c6f974c65faa66',1,'convertToVASurface()(Global Namespace)']]], - ['converttowindowcoordinates_1487',['convertToWindowCoordinates',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a36ca28b59f640bca8485a371e8269d71',1,'cv::viz::Viz3d']]], - ['converttuple_1488',['ConvertTuple',['https://docs.opencv.org/4.2.0/d9/d6a/structcv_1_1cudev_1_1ConvertTuple.html',1,'cv::cudev']]], - ['converttypestr_1489',['convertTypeStr',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga6af5cc5165cd65ae41925d6d95f0f7ae',1,'cv::ocl::convertTypeStr()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga6af5cc5165cd65ae41925d6d95f0f7ae',1,'convertTypeStr(int sdepth, int ddepth, int cn, char *buf)(Global Namespace)']]], - ['convex_20hull_1490',['Convex Hull',['https://docs.opencv.org/4.2.0/d7/d1d/tutorial_hull.html',1,'']]], - ['convex_5fhull_5fratio_1491',['convex_hull_ratio',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#ac2403bf2c45570b42a544f8a63052374',1,'cv::text::ERStat']]], - ['convexhull_1492',['convexHull',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga014b28e56cb8854c0de4a211cb2be656',1,'cv::convexHull()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga014b28e56cb8854c0de4a211cb2be656',1,'convexHull()(Global Namespace)']]], - ['convexhullfactor_1493',['convexHullFactor',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#ade182b1b8720f853fd771a4f94e4b494',1,'cv::CirclesGridFinderParameters']]], - ['convexitydefects_1494',['convexityDefects',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gada4437098113fd8683c932e0567f47ba',1,'cv::convexityDefects()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gada4437098113fd8683c932e0567f47ba',1,'convexityDefects()(Global Namespace)']]], - ['convolution_1495',['Convolution',['https://docs.opencv.org/4.2.0/d4/d25/classcv_1_1cuda_1_1Convolution.html',1,'cv::cuda']]], - ['convolutionlayer_1496',['ConvolutionLayer',['https://docs.opencv.org/4.2.0/d5/dcf/classcv_1_1dnn_1_1ConvolutionLayer.html',1,'cv::dnn']]], - ['convolve_1497',['convolve',['https://docs.opencv.org/4.2.0/d4/d25/classcv_1_1cuda_1_1Convolution.html#a5b7be73953386b725ba57b961a387886',1,'cv::cuda::Convolution']]], - ['copy_1498',['copy',['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#a3e21a51c4abc87e28025ebdfca98ca3d',1,'cv::MatAllocator::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ad4a99dc8d3755b195b89f4d0e2b5bb49',1,'__gnu_cxx::__versa_string::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< _CharT >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< _CharT, _Traits, _Allocator >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< char >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< char, char_traits< char >, _Byte_alloc >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< char_type, _Traits, _Alloc >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< value_type >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'std::basic_string::copy()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gae64ecdff179420eeacb6c9734a444265',1,'cv::gapi::copy()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gae64ecdff179420eeacb6c9734a444265',1,'copy()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga894f503412130680dc19c87af289f4f4',1,'std::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga894f503412130680dc19c87af289f4f4',1,'copy(_II __first, _II __last, _OI __result)(Global Namespace)']]], - ['copy_2ehpp_1499',['copy.hpp',['https://docs.opencv.org/4.2.0/d7/deb/copy_8hpp.html',1,'']]], - ['copy2d_1500',['copy2D',['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#ae6c1f0dc401821c42231e42b53ee2f6d',1,'NCVMatrix']]], - ['copy_5fbackward_1501',['copy_backward',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaf0de0305e64a82131960e2769624a740',1,'std::copy_backward()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaf0de0305e64a82131960e2769624a740',1,'copy_backward()(Global Namespace)']]], - ['copy_5fif_1502',['copy_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga0450d291c012c315181300fb83de8501',1,'std::copy_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga0450d291c012c315181300fb83de8501',1,'copy_if()(Global Namespace)']]], - ['copy_5fn_1503',['copy_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga72c21e0f95b2b3cb6ea2785ee4108b01',1,'__gnu_cxx::copy_n()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga6b6a2a5b1c55fb141030b8e6c8aad212',1,'std::copy_n()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga6b6a2a5b1c55fb141030b8e6c8aad212',1,'copy_n(_InputIterator __first, _Size __n, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga72c21e0f95b2b3cb6ea2785ee4108b01',1,'copy_n(_InputIterator __first, _Size __count, _OutputIterator __result)(Global Namespace)']]], - ['copy_5fon_5fmap_1504',['COPY_ON_MAP',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12a89c987098b1da2337f707fbbb118951f',1,'cv::UMatData']]], - ['copy_5foptions_1505',['copy_options',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298',1,]]], - ['copy_5fsymlinks_1506',['copy_symlinks',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a47a66bb90cd48feed3eafa4b77690ffe',1,'copy_symlinks(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a47a66bb90cd48feed3eafa4b77690ffe',1,'copy_symlinks(Global Namespace)']]], - ['copycoeff_1507',['copyCoeff',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a0abe130a9130ac6df16f3c8c55490b43',1,'Eigen::TriangularBase::copyCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a0abe130a9130ac6df16f3c8c55490b43',1,'TriangularBase< SelfAdjointView< _MatrixType, UpLo > >::copyCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a0abe130a9130ac6df16f3c8c55490b43',1,'TriangularBase< SelfAdjointView< const Derived, UpLo > >::copyCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a0abe130a9130ac6df16f3c8c55490b43',1,'TriangularBase< TriangularView< _MatrixType, _Mode > >::copyCoeff()']]], - ['copyfmt_1508',['copyfmt',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'basic_ios< char, _Traits >::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'basic_iostream< char >::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'basic_istream< char >::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'basic_istream< char, _Traits >::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'basic_ostream< char >::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'basic_ostream< char, _Traits >::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_fstream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_ifstream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_ios::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_iostream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_istream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_istringstream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_ofstream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_ostream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_ostringstream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_stringstream::copyfmt()']]], - ['copyfrom_1509',['copyFrom',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#adac4c20b821703eba30e68e3bba511a4',1,'cv::ogl::Buffer::copyFrom(InputArray arr, Target target=ARRAY_BUFFER, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#ae9a8b9910ae4f914faa7ad740e3d084f',1,'cv::ogl::Buffer::copyFrom(InputArray arr, cuda::Stream &stream, Target target=ARRAY_BUFFER, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#ab245ff921eb30efd321afc65e12960ec',1,'cv::ogl::Texture2D::copyFrom()']]], - ['copymakeborder_1510',['copyMakeBorder',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga2ac1049c2c3dd25c2b41bffe17658a36',1,'cv::copyMakeBorder()'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga5368db7656eacf846b40089c98053a49',1,'cv::cuda::copyMakeBorder()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga2ac1049c2c3dd25c2b41bffe17658a36',1,'copyMakeBorder(InputArray src, OutputArray dst, int top, int bottom, int left, int right, int borderType, const Scalar &value=Scalar())(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga5368db7656eacf846b40089c98053a49',1,'copyMakeBorder(InputArray src, OutputArray dst, int top, int bottom, int left, int right, int borderType, Scalar value=Scalar(), Stream &stream=Stream::Null())(Global Namespace)']]], - ['copymakeborder_2emarkdown_1511',['copyMakeBorder.markdown',['https://docs.opencv.org/4.2.0/d5/dca/copyMakeBorder_8markdown.html',1,'']]], - ['copyonmap_1512',['copyOnMap',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#ae5183bcbc64aa706848ef32401e4b202',1,'cv::UMatData']]], - ['copysize_1513',['copySize',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a39fd9880fc55b7a0993bcfff88061ac4',1,'cv::Mat::copySize()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a2ea1c1537ee15db8b22e34218a372f5f',1,'cv::UMat::copySize()']]], - ['copysolid_1514',['copySolid',['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#a1738e37856fbcbaf171f2741aa56cce3',1,'NCVMatrix::copySolid()'],['https://docs.opencv.org/4.2.0/dc/d73/classNCVVector.html#a0ddfc4f2f76b19e88bc9c69ce87404be',1,'NCVVector::copySolid()']]], - ['copyto_1515',['copyTo',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a938c12fa2b73e6aea81017fe8d31526e',1,'cv::_InputArray::copyTo(const _OutputArray &arr) const'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a20f3875b298bcd5d17a0a7e068f4518a',1,'cv::_InputArray::copyTo(const _OutputArray &arr, const _InputArray &mask) const'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a3aab3acc565ead059f4da0efb943db0a',1,'cv::ogl::Buffer::copyTo(OutputArray arr) const'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a563a63b77bd1c01b1bed7ea7740391c1',1,'cv::ogl::Buffer::copyTo(OutputArray arr, cuda::Stream &stream) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a948c562ee340c0678a44884bde1f5a3e',1,'cv::cuda::GpuMat::copyTo(OutputArray dst) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#adf64af21a2bb13276269584c2a6e1b81',1,'cv::cuda::GpuMat::copyTo(OutputArray dst, Stream &stream) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ad47f7b0aaf53fa904a6381e7d0192145',1,'cv::cuda::GpuMat::copyTo(OutputArray dst, InputArray mask) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a49b74a0ef2076543de438fadde55de7b',1,'cv::cuda::GpuMat::copyTo(OutputArray dst, InputArray mask, Stream &stream) const'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#ab133c13641d53944f48bb925f6d96cb1',1,'cv::HOGDescriptor::copyTo()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a33fd5d125b4c302b0c9aa86980791a77',1,'cv::Mat::copyTo(OutputArray m) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a626fe5f96d02525e2604d2ad46dd574f',1,'cv::Mat::copyTo(OutputArray m, InputArray mask) const'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a47cb530df8c61d0b3dfb7c7d3c240bfd',1,'cv::gapi::own::Mat::copyTo()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a18d9fb50fa768fd20e9f11b003906133',1,'cv::SparseMat::copyTo(SparseMat &m) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a6b077b6ec96d3aa588ef32e63cd7f7f5',1,'cv::SparseMat::copyTo(Mat &m) const'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1fbf47dc67b22fccbef45c20caba947e',1,'cv::ogl::Texture2D::copyTo()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ab9f4b02e099696dc0fb43c85c6f4a2f1',1,'cv::UMat::copyTo(OutputArray m) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a9f97eb1b8c307b5cd4c17962af27efbf',1,'cv::UMat::copyTo(OutputArray m, InputArray mask) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga931a49489330f998452fc53e96e1719a',1,'cv::copyTo()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga931a49489330f998452fc53e96e1719a',1,'copyTo()(Global Namespace)']]], - ['copytohost_1516',['copyToHost',['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#a06535a9363a71053aba8e328a75a6612',1,'cv::dnn::BackendWrapper']]], - ['core_1517',['NPPST Core',['https://docs.opencv.org/4.2.0/d5/ddd/group__core__npp.html',1,'']]], - ['core_20functionality_1518',['Core functionality',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html',1,'Core functionality'],['https://docs.opencv.org/4.2.0/df/d1f/group__gapi__core.html',1,'G-API Core functionality']]], - ['core_20functionality_20core_20module_1519',['The Core Functionality (core module)',['https://docs.opencv.org/4.2.0/de/d7a/tutorial_table_of_content_core.html',1,'']]], - ['core_20module_1520',['Core module',['https://eigen.tuxfamily.org/dox/group__Core__Module.html',1,'']]], - ['core_20module_1521',['The Core Functionality (core module)',['https://docs.opencv.org/4.2.0/de/d7a/tutorial_table_of_content_core.html',1,'']]], - ['core_20operations_1522',['Core Operations',['https://docs.opencv.org/4.2.0/d7/d16/tutorial_py_table_of_contents_core.html',1,'Core Operations'],['https://docs.opencv.org/4.2.0/d1/d78/tutorial_js_table_of_contents_core.html',1,'Core Operations']]], - ['core_20operations_20on_20matrices_1523',['Core Operations on Matrices',['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'']]], - ['core_20part_1524',['Core part',['https://docs.opencv.org/4.2.0/d7/d05/group__cudacore.html',1,'']]], - ['core_2ehpp_1525',['core.hpp',['https://docs.opencv.org/4.2.0/d2/ddb/core_2include_2opencv2_2core_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d9c/core_2include_2opencv2_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/df9/gapi_2include_2opencv2_2gapi_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/df2/gapi_2include_2opencv2_2gapi_2cpu_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d81/gapi_2include_2opencv2_2gapi_2fluid_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d1a/gapi_2include_2opencv2_2gapi_2gpu_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/db3/gapi_2include_2opencv2_2gapi_2ocl_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d2d/gapi_2include_2opencv2_2gapi_2plaidml_2core_8hpp.html',1,'(Global Namespace)']]], - ['core_5fdetect_2ehpp_1526',['core_detect.hpp',['https://docs.opencv.org/4.2.0/dd/d1b/core__detect_8hpp.html',1,'']]], - ['corner_1527',['corner',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a09619d632dd6979e9d09738493221d55',1,'Eigen::AlignedBox']]], - ['corner_20detection_1528',['Corner Detection',['https://docs.opencv.org/4.2.0/df/d0c/tutorial_py_fast.html',1,'FAST Algorithm for Corner Detection'],['https://docs.opencv.org/4.2.0/dc/d0d/tutorial_py_features_harris.html',1,'Harris Corner Detection']]], - ['corner_20detector_1529',['corner detector',['https://docs.opencv.org/4.2.0/d9/dbc/tutorial_generic_corner_detector.html',1,'Creating your own corner detector'],['https://docs.opencv.org/4.2.0/d4/d7d/tutorial_harris_detector.html',1,'Harris corner detector'],['https://docs.opencv.org/4.2.0/d8/dd8/tutorial_good_features_to_track.html',1,'Shi-Tomasi corner detector']]], - ['corner_20detector_20good_20features_20to_20track_1530',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], - ['corner_5frefine_5fapriltag_1531',['CORNER_REFINE_APRILTAG',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6a3e940dda27d11e803b40b51bde40f2c5',1,'cv::aruco::CORNER_REFINE_APRILTAG'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6a3e940dda27d11e803b40b51bde40f2c5',1,'CORNER_REFINE_APRILTAG(Global Namespace)']]], - ['corner_5frefine_5fcontour_1532',['CORNER_REFINE_CONTOUR',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6abef4b459cc329a3ab839773c0805e66a',1,'cv::aruco::CORNER_REFINE_CONTOUR'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6abef4b459cc329a3ab839773c0805e66a',1,'CORNER_REFINE_CONTOUR(Global Namespace)']]], - ['corner_5frefine_5fnone_1533',['CORNER_REFINE_NONE',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6adaab47b5a6c1a9519c31cd911799f397',1,'cv::aruco::CORNER_REFINE_NONE'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6adaab47b5a6c1a9519c31cd911799f397',1,'CORNER_REFINE_NONE(Global Namespace)']]], - ['corner_5frefine_5fsubpix_1534',['CORNER_REFINE_SUBPIX',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6a62ae78cbc223dfe552c99adbc9002e5b',1,'cv::aruco::CORNER_REFINE_SUBPIX'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6a62ae78cbc223dfe552c99adbc9002e5b',1,'CORNER_REFINE_SUBPIX(Global Namespace)']]], - ['corner_5fsubpixels_2emarkdown_1535',['corner_subpixels.markdown',['https://docs.opencv.org/4.2.0/dc/d29/corner__subpixels_8markdown.html',1,'']]], - ['cornereigenvalsandvecs_1536',['cornerEigenValsAndVecs',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga4055896d9ef77dd3cacf2c5f60e13f1c',1,'cv::cornerEigenValsAndVecs()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga4055896d9ef77dd3cacf2c5f60e13f1c',1,'cornerEigenValsAndVecs()(Global Namespace)']]], - ['cornerharris_1537',['cornerHarris',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gac1fc3598018010880e370e2f709b4345',1,'cv::cornerHarris()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gac1fc3598018010880e370e2f709b4345',1,'cornerHarris()(Global Namespace)']]], - ['cornermineigenval_1538',['cornerMinEigenVal',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga3dbce297c1feb859ee36707e1003e0a8',1,'cv::cornerMinEigenVal()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga3dbce297c1feb859ee36707e1003e0a8',1,'cornerMinEigenVal()(Global Namespace)']]], - ['cornernesscriteria_1539',['CornernessCriteria',['https://docs.opencv.org/4.2.0/dd/d63/classcv_1_1cuda_1_1CornernessCriteria.html',1,'cv::cuda']]], - ['cornerrefinementmaxiterations_1540',['cornerRefinementMaxIterations',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a65d86818818aee18f8646d2fdb8170d8',1,'cv::aruco::DetectorParameters']]], - ['cornerrefinementmethod_1541',['cornerRefinementMethod',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#aacfce88ccc0b5b494e002c9d63848760',1,'cv::aruco::DetectorParameters']]], - ['cornerrefinementminaccuracy_1542',['cornerRefinementMinAccuracy',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a2641f13e4f8a25403c828eee5c77a8dd',1,'cv::aruco::DetectorParameters']]], - ['cornerrefinementwinsize_1543',['cornerRefinementWinSize',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a21ff1cd9084c3695bc0b1d043d5b3bca',1,'cv::aruco::DetectorParameters']]], - ['cornerrefinemethod_1544',['CornerRefineMethod',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gafce26321f39d331bc12032a72b90eda6',1,'cv::aruco::CornerRefineMethod'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gafce26321f39d331bc12032a72b90eda6',1,'CornerRefineMethod(Global Namespace)']]], - ['corners_1545',['Detection of ChArUco Corners',['https://docs.opencv.org/4.2.0/df/d4a/tutorial_charuco_detection.html',1,'']]], - ['corners_20location_20in_20subpixels_1546',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], - ['corners_5f_1547',['corners_',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a73b7891ed68d55b25011fbcdb6d5f4da',1,'cv::detail::PairwiseSeamFinder']]], - ['cornersdetector_1548',['CornersDetector',['https://docs.opencv.org/4.2.0/de/d95/classcv_1_1cuda_1_1CornersDetector.html',1,'cv::cuda']]], - ['cornersubpix_1549',['cornerSubPix',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga354e0d7c86d0d9da75de9b9701a9a87e',1,'cv::cornerSubPix()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga354e0d7c86d0d9da75de9b9701a9a87e',1,'cornerSubPix()(Global Namespace)']]], - ['cornertype_1550',['CornerType',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378',1,'Eigen::AlignedBox']]], - ['corr_1551',['corr',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga4e5c90ed9b9e3e509adbf2bb834c272a',1,'cv::stereo::Match::corr'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga4e5c90ed9b9e3e509adbf2bb834c272a',1,'corr(Global Namespace)']]], - ['correct_1552',['correct',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a60eb7feb569222ad0657ef1875884b5e',1,'cv::KalmanFilter::correct()'],['https://docs.opencv.org/4.2.0/de/d72/classcv_1_1tracking_1_1UnscentedKalmanFilter.html#a11ecf6a0d437bea991949b8d243ca598',1,'cv::tracking::UnscentedKalmanFilter::correct()'],['../classfilters_1_1ExtendedKalmanFilter.html#a5c64d08bb61f55a50c3a45951a4bd478',1,'filters::ExtendedKalmanFilter::correct()'],['../classfilters_1_1KalmanFilter.html#aac101e5a7fbfbeeb0a33dbbe227130ff',1,'filters::KalmanFilter::correct()']]], - ['correctmatches_1553',['correctMatches',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaf32c99d17908e175ac71e7a08fad587b',1,'cv::correctMatches()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaf32c99d17908e175ac71e7a08fad587b',1,'correctMatches()(Global Namespace)']]], - ['correlationthreshold_1554',['correlationThreshold',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gabcfaaffa086614f85be49ceddcad328f',1,'cv::stereo::PropagationParameters::correlationThreshold'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gabcfaaffa086614f85be49ceddcad328f',1,'correlationThreshold(Global Namespace)']]], - ['correspondance_20algorithms_1555',['Stereo Correspondance Algorithms',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html',1,'']]], - ['correspondence_1556',['Stereo Correspondence',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html',1,'']]], - ['corrwinsizex_1557',['corrWinSizeX',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga70b71f71badb30717fbf5aeaa0d30a2f',1,'cv::stereo::PropagationParameters::corrWinSizeX'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga70b71f71badb30717fbf5aeaa0d30a2f',1,'corrWinSizeX(Global Namespace)']]], - ['corrwinsizey_1558',['corrWinSizeY',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga793edfcbae69a2fb3222d83b87add541',1,'cv::stereo::PropagationParameters::corrWinSizeY'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga793edfcbae69a2fb3222d83b87add541',1,'corrWinSizeY(Global Namespace)']]], - ['cos_1559',['cos',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a34d626eb756bbeb4069d1eb0e6494c65',1,'Eigen::MatrixBase::cos()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a34d626eb756bbeb4069d1eb0e6494c65',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::cos()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a34d626eb756bbeb4069d1eb0e6494c65',1,'MatrixBase< Solve< Decomposition, RhsType > >::cos()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga164d580371866184ddc96fa7aaf47085',1,'cv::cos()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2591489e47c1cb227d235872e4b5e433',1,'cv::cudev::cos(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb0891a2bcca020e132440ee65a5c607',1,'cv::cudev::cos(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35043d3aba80393fbfb32088aaf844c',1,'cv::cudev::cos(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dfd969175f09a6e3cdb929446c7fb33',1,'cv::cudev::cos(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9cf8a788be723f41335cecd9153c099',1,'cv::cudev::cos(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5c2f77b57c0110f99e599da242727e9',1,'cv::cudev::cos(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72652522912e6ad566ab1fa77866e5f3',1,'cv::cudev::cos(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66f81aade259c34ab035cacd0cc37bc1',1,'cv::cudev::cos(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22d5c772cab063db3d2f9c2031b69445',1,'cv::cudev::cos(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92d6a089d3dbe7ea3295a8c99e21d73e',1,'cv::cudev::cos(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8be3c68d3db47d895ebf224d360f6c8',1,'cv::cudev::cos(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fef66cbf46ebf3ef532230121b1a0b5',1,'cv::cudev::cos(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b4d98b7371281aa2a10348ba246eb3d',1,'cv::cudev::cos(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb0d2b5daa4ea3a0f189f9650963a32c',1,'cv::cudev::cos(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga255d10d58f7597c1578be436742fe543',1,'cv::cudev::cos(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga731341b35da58834dc18c6753a8da14a',1,'cv::cudev::cos(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b03de2befefa2bdbffec33deeed31a6',1,'cv::cudev::cos(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ad62c2d0b78462811fd8667fbd8481',1,'cv::cudev::cos(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0c5d9a1a2d4ede74c63a373591453ad',1,'cv::cudev::cos(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga614c72b0e509e0de4e3ca042be6a38ff',1,'cv::cudev::cos(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44e66152581a801cbcdf6964ebbfe638',1,'cv::cudev::cos(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e0ac1b0db3ec6a7d004e1fc89dbf0af',1,'cv::cudev::cos(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4736725d299734065522400709e326eb',1,'cv::cudev::cos(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58d5b8a370d171048ac0bddc80321294',1,'cv::cudev::cos(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8a535934d73f45bfd60af81a6329b97',1,'cv::cudev::cos(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad4f55ee28b604c4177745c82127aed31',1,'cv::cudev::cos(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6ee36d3a4ea3fd487c6791b419c4e01',1,'cv::cudev::cos(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94358d7d0160d663a8789a9d760b2e42',1,'cv::cudev::cos(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ccd620456aa6135c2b91a1493a12404',1,'cv::cudev::cos(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga461b58306fbcd02c60ccee7cce7ae2f7',1,'cv::cudev::cos(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga171d264f0dd241cf3eab46d954fb6059',1,'cv::cudev::cos(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee438c36ad49662bc9c574e2110052fd',1,'cv::cudev::cos(const double4 &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga164d580371866184ddc96fa7aaf47085',1,'cos(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2591489e47c1cb227d235872e4b5e433',1,'cos(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb0891a2bcca020e132440ee65a5c607',1,'cos(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35043d3aba80393fbfb32088aaf844c',1,'cos(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dfd969175f09a6e3cdb929446c7fb33',1,'cos(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9cf8a788be723f41335cecd9153c099',1,'cos(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5c2f77b57c0110f99e599da242727e9',1,'cos(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72652522912e6ad566ab1fa77866e5f3',1,'cos(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66f81aade259c34ab035cacd0cc37bc1',1,'cos(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22d5c772cab063db3d2f9c2031b69445',1,'cos(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92d6a089d3dbe7ea3295a8c99e21d73e',1,'cos(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8be3c68d3db47d895ebf224d360f6c8',1,'cos(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fef66cbf46ebf3ef532230121b1a0b5',1,'cos(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b4d98b7371281aa2a10348ba246eb3d',1,'cos(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb0d2b5daa4ea3a0f189f9650963a32c',1,'cos(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga255d10d58f7597c1578be436742fe543',1,'cos(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga731341b35da58834dc18c6753a8da14a',1,'cos(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b03de2befefa2bdbffec33deeed31a6',1,'cos(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ad62c2d0b78462811fd8667fbd8481',1,'cos(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0c5d9a1a2d4ede74c63a373591453ad',1,'cos(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga614c72b0e509e0de4e3ca042be6a38ff',1,'cos(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44e66152581a801cbcdf6964ebbfe638',1,'cos(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e0ac1b0db3ec6a7d004e1fc89dbf0af',1,'cos(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4736725d299734065522400709e326eb',1,'cos(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58d5b8a370d171048ac0bddc80321294',1,'cos(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8a535934d73f45bfd60af81a6329b97',1,'cos(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad4f55ee28b604c4177745c82127aed31',1,'cos(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6ee36d3a4ea3fd487c6791b419c4e01',1,'cos(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94358d7d0160d663a8789a9d760b2e42',1,'cos(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ccd620456aa6135c2b91a1493a12404',1,'cos(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga461b58306fbcd02c60ccee7cce7ae2f7',1,'cos(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga171d264f0dd241cf3eab46d954fb6059',1,'cos(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee438c36ad49662bc9c574e2110052fd',1,'cos(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaed6443d175b556280b801357758d1526',1,'std::cos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaed6443d175b556280b801357758d1526',1,'cos()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad01d50a42869218f1d54af13f71517a6',1,'Eigen::cos()']]], - ['cos_5f_1560',['cos_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1887cbcbe6962f0c1c031f58898eadd8',1,'cv::cudev::cos_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1887cbcbe6962f0c1c031f58898eadd8',1,'cos_()(Global Namespace)']]], - ['cos_5ffunc_1561',['cos_func',['https://docs.opencv.org/4.2.0/d6/dfb/structcv_1_1cudev_1_1cos__func.html',1,'cv::cudev']]], - ['cos_5ffunc_3c_20double_20_3e_1562',['cos_func< double >',['https://docs.opencv.org/4.2.0/db/d23/structcv_1_1cudev_1_1cos__func_3_01double_01_4.html',1,'cv::cudev']]], - ['cos_5ffunc_3c_20float_20_3e_1563',['cos_func< float >',['https://docs.opencv.org/4.2.0/dd/d7a/structcv_1_1cudev_1_1cos__func_3_01float_01_4.html',1,'cv::cudev']]], - ['cos_5ffunc_3c_20schar_20_3e_1564',['cos_func< schar >',['https://docs.opencv.org/4.2.0/dc/d25/structcv_1_1cudev_1_1cos__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['cos_5ffunc_3c_20short_20_3e_1565',['cos_func< short >',['https://docs.opencv.org/4.2.0/d7/d03/structcv_1_1cudev_1_1cos__func_3_01short_01_4.html',1,'cv::cudev']]], - ['cos_5ffunc_3c_20uchar_20_3e_1566',['cos_func< uchar >',['https://docs.opencv.org/4.2.0/dd/d3d/structcv_1_1cudev_1_1cos__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['cos_5ffunc_3c_20uint_20_3e_1567',['cos_func< uint >',['https://docs.opencv.org/4.2.0/da/dc1/structcv_1_1cudev_1_1cos__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['cos_5ffunc_3c_20ushort_20_3e_1568',['cos_func< ushort >',['https://docs.opencv.org/4.2.0/df/d35/structcv_1_1cudev_1_1cos__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['cosdistance_1569',['CosDistance',['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1tbm_1_1CosDistance.html',1,'cv::tbm::CosDistance'],['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1tbm_1_1CosDistance.html#aa06f335e1d6cdcd7a1d2adf6085e107a',1,'cv::tbm::CosDistance::CosDistance()']]], - ['cosh_1570',['cosh',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a627e6f11bf5854ade9a5abfc344c0367',1,'Eigen::MatrixBase::cosh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a627e6f11bf5854ade9a5abfc344c0367',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::cosh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a627e6f11bf5854ade9a5abfc344c0367',1,'MatrixBase< Solve< Decomposition, RhsType > >::cosh()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae82583ed9295e93a53c94d9753beefa2',1,'cv::cudev::cosh(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80abf13c753878730bd80b8d36e4613d',1,'cv::cudev::cosh(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1687895cecca5f84f28a584be39cd45e',1,'cv::cudev::cosh(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa21ad815bb9532046f47a05480ade46f',1,'cv::cudev::cosh(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa5385058a167c0c40d8f6b340e4a88d',1,'cv::cudev::cosh(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae42205ebe2e6a4ab6de590e3d7f3365',1,'cv::cudev::cosh(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1710177b61623035d671d74d7b1a7f6f',1,'cv::cudev::cosh(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc6eccad17e0e46d9cbd281c3e711aa9',1,'cv::cudev::cosh(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3d36b54ba6e7d9422539e8f5eabc053',1,'cv::cudev::cosh(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41a0f2e8c3df8313cd209872fbb077be',1,'cv::cudev::cosh(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1754815132974b404ef08a43fce6b3b',1,'cv::cudev::cosh(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9e0ffa2a4ba694240a28d57b3f834e0',1,'cv::cudev::cosh(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71710adfe141bc6466876c09802c3a7c',1,'cv::cudev::cosh(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a037e284c591470524139208b1025df',1,'cv::cudev::cosh(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b5476ae05fe592cb06219258730bda1',1,'cv::cudev::cosh(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa35c3ba592ccb566e04d90280066d81',1,'cv::cudev::cosh(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8feac9f8209680ba64997b6d9912b96b',1,'cv::cudev::cosh(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadca5aea02a7a85d548f637f972795df3',1,'cv::cudev::cosh(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39a476e90ccfbd91a3c1ac9683d42717',1,'cv::cudev::cosh(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19836eff7f699fb4af5ee437366bb38a',1,'cv::cudev::cosh(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc73dc8cc041afbb14d9c980c660ac89',1,'cv::cudev::cosh(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50bc228a397b21f233bfc9e785699344',1,'cv::cudev::cosh(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79a6ce397211e4078419448a1305caf2',1,'cv::cudev::cosh(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e07fc50c9ed8d4e32809ed9edb557b6',1,'cv::cudev::cosh(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf69361dca85955ba79af70994316581',1,'cv::cudev::cosh(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59924137a98c7d90f104d514af9763a0',1,'cv::cudev::cosh(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06c1f05283d886d6fe08833b58a93439',1,'cv::cudev::cosh(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga694f901aa66cf52a8c6c128d2b09a155',1,'cv::cudev::cosh(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7307bc4d07873875669d9c9586de2714',1,'cv::cudev::cosh(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec1829fdd7ff85865280fc99b9e7c35b',1,'cv::cudev::cosh(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga047c8aebd23c78678261898a69a0d68f',1,'cv::cudev::cosh(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38446fad6569393135149ae21e0155db',1,'cv::cudev::cosh(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae82583ed9295e93a53c94d9753beefa2',1,'cosh(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80abf13c753878730bd80b8d36e4613d',1,'cosh(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1687895cecca5f84f28a584be39cd45e',1,'cosh(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa21ad815bb9532046f47a05480ade46f',1,'cosh(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa5385058a167c0c40d8f6b340e4a88d',1,'cosh(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae42205ebe2e6a4ab6de590e3d7f3365',1,'cosh(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1710177b61623035d671d74d7b1a7f6f',1,'cosh(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc6eccad17e0e46d9cbd281c3e711aa9',1,'cosh(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3d36b54ba6e7d9422539e8f5eabc053',1,'cosh(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41a0f2e8c3df8313cd209872fbb077be',1,'cosh(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1754815132974b404ef08a43fce6b3b',1,'cosh(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9e0ffa2a4ba694240a28d57b3f834e0',1,'cosh(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71710adfe141bc6466876c09802c3a7c',1,'cosh(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a037e284c591470524139208b1025df',1,'cosh(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b5476ae05fe592cb06219258730bda1',1,'cosh(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa35c3ba592ccb566e04d90280066d81',1,'cosh(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8feac9f8209680ba64997b6d9912b96b',1,'cosh(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadca5aea02a7a85d548f637f972795df3',1,'cosh(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39a476e90ccfbd91a3c1ac9683d42717',1,'cosh(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19836eff7f699fb4af5ee437366bb38a',1,'cosh(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc73dc8cc041afbb14d9c980c660ac89',1,'cosh(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50bc228a397b21f233bfc9e785699344',1,'cosh(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79a6ce397211e4078419448a1305caf2',1,'cosh(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e07fc50c9ed8d4e32809ed9edb557b6',1,'cosh(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf69361dca85955ba79af70994316581',1,'cosh(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59924137a98c7d90f104d514af9763a0',1,'cosh(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06c1f05283d886d6fe08833b58a93439',1,'cosh(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga694f901aa66cf52a8c6c128d2b09a155',1,'cosh(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7307bc4d07873875669d9c9586de2714',1,'cosh(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec1829fdd7ff85865280fc99b9e7c35b',1,'cosh(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga047c8aebd23c78678261898a69a0d68f',1,'cosh(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38446fad6569393135149ae21e0155db',1,'cosh(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga8ab9fb6ce0469e0144c41f40e49a63dc',1,'std::cosh()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga8ab9fb6ce0469e0144c41f40e49a63dc',1,'cosh()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a34b99a26a2a1e7ff985a5ace16eedfcb',1,'Eigen::cosh()']]], - ['cosh_5f_1571',['cosh_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9274848df665b6483dd5063bda2eef19',1,'cv::cudev::cosh_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9274848df665b6483dd5063bda2eef19',1,'cosh_()(Global Namespace)']]], - ['cosh_5ffunc_1572',['cosh_func',['https://docs.opencv.org/4.2.0/dc/d8a/structcv_1_1cudev_1_1cosh__func.html',1,'cv::cudev']]], - ['cosh_5ffunc_3c_20double_20_3e_1573',['cosh_func< double >',['https://docs.opencv.org/4.2.0/d5/d3a/structcv_1_1cudev_1_1cosh__func_3_01double_01_4.html',1,'cv::cudev']]], - ['cosh_5ffunc_3c_20float_20_3e_1574',['cosh_func< float >',['https://docs.opencv.org/4.2.0/db/d8d/structcv_1_1cudev_1_1cosh__func_3_01float_01_4.html',1,'cv::cudev']]], - ['cosh_5ffunc_3c_20schar_20_3e_1575',['cosh_func< schar >',['https://docs.opencv.org/4.2.0/df/dd8/structcv_1_1cudev_1_1cosh__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['cosh_5ffunc_3c_20short_20_3e_1576',['cosh_func< short >',['https://docs.opencv.org/4.2.0/dc/d8a/structcv_1_1cudev_1_1cosh__func_3_01short_01_4.html',1,'cv::cudev']]], - ['cosh_5ffunc_3c_20uchar_20_3e_1577',['cosh_func< uchar >',['https://docs.opencv.org/4.2.0/de/d73/structcv_1_1cudev_1_1cosh__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['cosh_5ffunc_3c_20uint_20_3e_1578',['cosh_func< uint >',['https://docs.opencv.org/4.2.0/d5/ddd/structcv_1_1cudev_1_1cosh__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['cosh_5ffunc_3c_20ushort_20_3e_1579',['cosh_func< ushort >',['https://docs.opencv.org/4.2.0/d2/dd3/structcv_1_1cudev_1_1cosh__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['cost_5fcolor_1580',['COST_COLOR',['https://docs.opencv.org/4.2.0/d0/d03/classcv_1_1detail_1_1GraphCutSeamFinderBase.html#a42953bdb4c8a234670d37c5b5f4386cbafe0d275582723d93a0c576584ea90091',1,'cv::detail::GraphCutSeamFinderBase']]], - ['cost_5fcolor_5fgrad_1581',['COST_COLOR_GRAD',['https://docs.opencv.org/4.2.0/d0/d03/classcv_1_1detail_1_1GraphCutSeamFinderBase.html#a42953bdb4c8a234670d37c5b5f4386cba4e0af02eed7c3f02976244dc832e0e81',1,'cv::detail::GraphCutSeamFinderBase']]], - ['costfunction_1582',['CostFunction',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a6ce104a17b48a0503ccdcf4787ba2ef3',1,'cv::detail::DpSeamFinder']]], - ['costfunction_1583',['costFunction',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#adc483aee372fbff08d564e991e6dd232',1,'cv::detail::DpSeamFinder']]], - ['costgathering_1584',['costGathering',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a1c680ef014108eee62eb2269c3c480ca',1,'cv::stereo::Matching']]], - ['costtype_1585',['CostType',['https://docs.opencv.org/4.2.0/d0/d03/classcv_1_1detail_1_1GraphCutSeamFinderBase.html#a42953bdb4c8a234670d37c5b5f4386cb',1,'cv::detail::GraphCutSeamFinderBase']]], - ['count_1586',['count',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a78e06b7798ab056aba770b6e49c549b4',1,'cv::LineIterator::count'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a38038359e14d9ca22874787801a300f0',1,'cv::tbm::ITrackerByMatching::count()'],['https://docs.opencv.org/4.2.0/da/d0b/classcv_1_1videostab_1_1VideoFileSource.html#a76fe6c31e6baa71fd8fa002345c44815',1,'cv::videostab::VideoFileSource::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ad4633f8abd7e24be8f0315dff4a0882c',1,'std::bitset::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a44da6d0dc51d80a873cc9405a805c712',1,'std::map::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a1264d32ee2fd0cfaee914fbafc088b54',1,'std::map::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a44da6d0dc51d80a873cc9405a805c712',1,'std::map::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a1264d32ee2fd0cfaee914fbafc088b54',1,'std::map::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ae7e0864011c6d6f81b75ba797edd4d9f',1,'std::multimap::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a671c765d67fd2319e73c1b5b3ceab7de',1,'std::multimap::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ae7e0864011c6d6f81b75ba797edd4d9f',1,'std::multimap::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a671c765d67fd2319e73c1b5b3ceab7de',1,'std::multimap::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a9f81b59c35ee0ef55f8a49aa63c7ed66',1,'std::multiset::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a4003ef6187ecbbdce62b861222c09802',1,'std::multiset::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a9f81b59c35ee0ef55f8a49aa63c7ed66',1,'std::multiset::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a4003ef6187ecbbdce62b861222c09802',1,'std::multiset::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a1164f8c8d8b92b1b4be8a313cede8abe',1,'std::set::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a659cf2314514a8cf2d6ecc68d08bf2ca',1,'std::set::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a1164f8c8d8b92b1b4be8a313cede8abe',1,'std::set::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a659cf2314514a8cf2d6ecc68d08bf2ca',1,'std::set::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aa79c5f403196eb4ba5d037710830c683',1,'std::tr2::dynamic_bitset::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a4cbd19e5e859635c70822a7e1faa8e36',1,'std::unordered_map::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a323e46db071ea6d46dca69efbbc4d075',1,'std::unordered_multimap::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a758853e33d8b9dae33851ee71b42b0c8',1,'std::unordered_multiset::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a1f89dfe5f4807151e3829f060b103efc',1,'std::unordered_set::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a4cbd19e5e859635c70822a7e1faa8e36',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a229be090c665b9bf7d1fcdfd1ab6e0c1',1,'Eigen::DenseBase::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a229be090c665b9bf7d1fcdfd1ab6e0c1',1,'DenseBase< ArrayWrapper< ExpressionType > >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a229be090c665b9bf7d1fcdfd1ab6e0c1',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a229be090c665b9bf7d1fcdfd1ab6e0c1',1,'DenseBase< Solve< Decomposition, RhsType > >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'Eigen::VectorwiseOp::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const Derived, Horizontal >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const Derived, Vertical >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::count()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aba5ec6d1e37eda6b11eba491a1e5237e.html#aba5ec6d1e37eda6b11eba491a1e5237e',1,'nlohmann::basic_json::count()'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_aee2c188dcc802d6b28910f707a5e637b.html#aee2c188dcc802d6b28910f707a5e637b',1,'nlohmann::ordered_map::count()']]], - ['count_1587',['COUNT',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57aeb9da694ea67b3ef7d524521b580867d',1,'cv::TermCriteria']]], - ['count_1588',['count',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad2f89a1340c43c8451e522d045aaa1b6',1,'std::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad2f89a1340c43c8451e522d045aaa1b6',1,'count()(Global Namespace)']]], - ['count_5fdown_1589',['count_down',['../classutil_1_1latch.html#a3908add3019e65deb93a1a2b305a38b2',1,'util::latch']]], - ['count_5fif_1590',['count_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gab17add9e8922a4e8a9893d0d094f5e4e',1,'std::count_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gab17add9e8922a4e8a9893d0d094f5e4e',1,'count_if()(Global Namespace)']]], - ['count_5fminimal_5fn_1591',['count_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ad8cdfe2324ea2ea32021f2625b2299f1',1,'__gnu_parallel::_Settings']]], - ['countframesize_1592',['countFrameSize',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a21d0a77e972f843701cf5c846b900f1c',1,'cv::AVIWriteContainer']]], - ['countnonzero_1593',['countNonZero',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa4b89393263bb4d604e0fe5986723914',1,'cv::countNonZero()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga283f3efccb513dbcde9f1dbedb67f805',1,'cv::cuda::countNonZero(InputArray src)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga55b5d553d28530fae0d9242438396521',1,'cv::cuda::countNonZero(InputArray src, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa4b89393263bb4d604e0fe5986723914',1,'countNonZero(InputArray src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga283f3efccb513dbcde9f1dbedb67f805',1,'countNonZero(InputArray src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga55b5d553d28530fae0d9242438396521',1,'countNonZero(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['countnonzero_5f_1594',['countNonZero_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga635f159cb2cc2ed5af960165ce89f3b9',1,'cv::cudev::countNonZero_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga635f159cb2cc2ed5af960165ce89f3b9',1,'countNonZero_()(Global Namespace)']]], - ['countnonzeroexprbody_1595',['CountNonZeroExprBody',['https://docs.opencv.org/4.2.0/dd/d49/structcv_1_1cudev_1_1CountNonZeroExprBody.html',1,'cv::cudev']]], - ['cout_1596',['cout',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aaf93fdf0812752e0e02c501dea1b38f0',1,'std::cout'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aaf93fdf0812752e0e02c501dea1b38f0',1,'std::cout']]], - ['cov_5fmat_5fdefault_1597',['COV_MAT_DEFAULT',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ad993005b665024ea3c067c4cccd4e898a058904bf7cacd90252c8e3499f3abfaa',1,'cv::ml::EM']]], - ['cov_5fmat_5fdiagonal_1598',['COV_MAT_DIAGONAL',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ad993005b665024ea3c067c4cccd4e898ab5fdfaa68417f5f0d2b147c6fded361d',1,'cv::ml::EM']]], - ['cov_5fmat_5fgeneric_1599',['COV_MAT_GENERIC',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ad993005b665024ea3c067c4cccd4e898a4d6181530b2faaed9bbf8ba9e9ce25d9',1,'cv::ml::EM']]], - ['cov_5fmat_5fspherical_1600',['COV_MAT_SPHERICAL',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ad993005b665024ea3c067c4cccd4e898a5e6f007058bf35fdd639811be7320f01',1,'cv::ml::EM']]], - ['covar_5fcols_1601',['COVAR_COLS',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fac8cc5a80914e18d6100184a2829aa3c0',1,'cv::COVAR_COLS'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fac8cc5a80914e18d6100184a2829aa3c0',1,'COVAR_COLS(Global Namespace)']]], - ['covar_5fnormal_1602',['COVAR_NORMAL',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fa5ff1530be25ae14f9a652788a4c26a92',1,'cv::COVAR_NORMAL'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fa5ff1530be25ae14f9a652788a4c26a92',1,'COVAR_NORMAL(Global Namespace)']]], - ['covar_5frows_1603',['COVAR_ROWS',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fadbac775ac8245aad5bfef994731c635f',1,'cv::COVAR_ROWS'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fadbac775ac8245aad5bfef994731c635f',1,'COVAR_ROWS(Global Namespace)']]], - ['covar_5fscale_1604',['COVAR_SCALE',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fac9b7943fc9402898978cbfa22717441c',1,'cv::COVAR_SCALE'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fac9b7943fc9402898978cbfa22717441c',1,'COVAR_SCALE(Global Namespace)']]], - ['covar_5fscrambled_1605',['COVAR_SCRAMBLED',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fa6fb4e6e0255e4fe67972a00d1c7936d6',1,'cv::COVAR_SCRAMBLED'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fa6fb4e6e0255e4fe67972a00d1c7936d6',1,'COVAR_SCRAMBLED(Global Namespace)']]], - ['covar_5fuse_5favg_1606',['COVAR_USE_AVG',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fa460c69e5ccfb86ea54c61222ab62dea6',1,'cv::COVAR_USE_AVG'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fa460c69e5ccfb86ea54c61222ab62dea6',1,'COVAR_USE_AVG(Global Namespace)']]], - ['covarflags_1607',['CovarFlags',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga719ebd4a73f30f4fab258ab7616d0f0f',1,'cv::CovarFlags'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga719ebd4a73f30f4fab258ab7616d0f0f',1,'CovarFlags(Global Namespace)']]], - ['covarianceestimation_1608',['covarianceEstimation',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a8db2552ff9a24347332cae1c94fef230',1,'cv::ximgproc']]], - ['cp_1609',['CP',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#ac45dca7c8856e9b2bd9f07a44a6fbbbe',1,'cv::tracking::UnscentedKalmanFilterParams']]], - ['cparams_1610',['CParams',['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html',1,'cv::face::CParams'],['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html#a5da1bcff28e94d582261446703ccc03a',1,'cv::face::CParams::CParams()']]], - ['cpp_5ftype_5ftraits_2eh_1611',['cpp_type_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00311.html',1,'']]], - ['cpu_5favx_1612',['CPU_AVX',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a8faf81b6ed314cc932826ec4ea4d59a6',1,]]], - ['cpu_5favx2_1613',['CPU_AVX2',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a1fd6cf1ee58909592878a2ae274b5bce',1,]]], - ['cpu_5favx512_5fclx_1614',['CPU_AVX512_CLX',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a4d92bbd932458c2ac0e96c308615a6e1',1,]]], - ['cpu_5favx512_5fcnl_1615',['CPU_AVX512_CNL',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a7bcac929667950d65a0c2ac6fd64b986',1,]]], - ['cpu_5favx512_5fcommon_1616',['CPU_AVX512_COMMON',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a5786d569bd24b546c11418acae892a44',1,]]], - ['cpu_5favx512_5ficl_1617',['CPU_AVX512_ICL',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a9fe5c0fcdc110feeab7bf419de345eb4',1,]]], - ['cpu_5favx512_5fknl_1618',['CPU_AVX512_KNL',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a671daf4752ced762cdfe88f75a320937',1,]]], - ['cpu_5favx512_5fknm_1619',['CPU_AVX512_KNM',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a32aedb3a821d22467045dd8bfd7576f5',1,]]], - ['cpu_5favx512_5fskx_1620',['CPU_AVX512_SKX',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a5e72cc7c10e55160242460978d8dc460',1,]]], - ['cpu_5favx_5f5124fmaps_1621',['CPU_AVX_5124FMAPS',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a5ff43f81296f5c13087c01799de330a6',1,]]], - ['cpu_5favx_5f5124vnniw_1622',['CPU_AVX_5124VNNIW',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a4788b43d115eafb0314c01bacc3eb2bb',1,]]], - ['cpu_5favx_5f512bitalg_1623',['CPU_AVX_512BITALG',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ab8b16554165a17d3d890664d40fc457b',1,]]], - ['cpu_5favx_5f512bw_1624',['CPU_AVX_512BW',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ac5c16e10f1d719cc4ff4c11878c809fd',1,]]], - ['cpu_5favx_5f512cd_1625',['CPU_AVX_512CD',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a4f75062ee0470932b4dd3978c3da2345',1,]]], - ['cpu_5favx_5f512dq_1626',['CPU_AVX_512DQ',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a23c406eee21d3aa60ad7e4bfa148cfb0',1,]]], - ['cpu_5favx_5f512er_1627',['CPU_AVX_512ER',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a779eb756852e076a003a2da29ba0d05b',1,]]], - ['cpu_5favx_5f512f_1628',['CPU_AVX_512F',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802acbfa5ea4ac4b55dce9f02f916d4ba9c3',1,]]], - ['cpu_5favx_5f512ifma_1629',['CPU_AVX_512IFMA',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a25d8dd19ee03a6b199ca4afaa23fbca4',1,]]], - ['cpu_5favx_5f512ifma512_1630',['CPU_AVX_512IFMA512',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a52a18ce1a21f9b5156d130c40f6c0cd5',1,]]], - ['cpu_5favx_5f512pf_1631',['CPU_AVX_512PF',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ac3a4b309028719f9f46aa7480e3e2e93',1,]]], - ['cpu_5favx_5f512vbmi_1632',['CPU_AVX_512VBMI',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802af76a5d20542b93012367365e08f88ea6',1,]]], - ['cpu_5favx_5f512vbmi2_1633',['CPU_AVX_512VBMI2',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a014124a819d12e5a85c8b4fd285d6105',1,]]], - ['cpu_5favx_5f512vl_1634',['CPU_AVX_512VL',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a21b83178d761387f54d0986947e4b8c3',1,]]], - ['cpu_5favx_5f512vnni_1635',['CPU_AVX_512VNNI',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a0bd7fdf0fb2c21af26b006771b2599f7',1,]]], - ['cpu_5favx_5f512vpopcntdq_1636',['CPU_AVX_512VPOPCNTDQ',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ae5fd72dbef2a849e2c6470a4949c3b1d',1,]]], - ['cpu_5fdefines_2eh_1637',['cpu_defines.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00677.html',1,'']]], - ['cpu_5ffma3_1638',['CPU_FMA3',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a2b4ba6413e255bc9bb90e577013f770d',1,]]], - ['cpu_5ffp16_1639',['CPU_FP16',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ac995a654aedc70043bbe8b709f3cc5f4',1,]]], - ['cpu_5fmax_5ffeature_1640',['CPU_MAX_FEATURE',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a6b5b12670914dcac265df838e90b5813',1,]]], - ['cpu_5fmmx_1641',['CPU_MMX',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802aa7dd25359af89cd60e31edf9524294da',1,]]], - ['cpu_5fmsa_1642',['CPU_MSA',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a9eb9e92522f4304a0fb088e537fc907f',1,]]], - ['cpu_5fneon_1643',['CPU_NEON',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a8612b40158337dbe9d846a1e937670ac',1,]]], - ['cpu_5fpopcnt_1644',['CPU_POPCNT',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a285100483dfe9b0c22bb152abf4d23e6',1,]]], - ['cpu_5fsse_1645',['CPU_SSE',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a6cd6b333ce30a64366342bc42200898f',1,]]], - ['cpu_5fsse2_1646',['CPU_SSE2',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802aea8f9d1f74db87af707691acd35749b2',1,]]], - ['cpu_5fsse3_1647',['CPU_SSE3',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a2a990ca5b0f8a7df7915183b289dd6c2',1,]]], - ['cpu_5fsse4_5f1_1648',['CPU_SSE4_1',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802aacc2331d1c0c6dbb66700f70636a939f',1,]]], - ['cpu_5fsse4_5f2_1649',['CPU_SSE4_2',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a78871769cbf689bc323089879b445880',1,]]], - ['cpu_5fssse3_1650',['CPU_SSSE3',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ae0dcb0edfce2304ce1c52356c007ca9d',1,]]], - ['cpu_5fvsx_1651',['CPU_VSX',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a950cffa6194f894aef53bad183ad235d',1,]]], - ['cpu_5fvsx3_1652',['CPU_VSX3',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ac74c287e1c17e424150dc91f40ea629f',1,]]], - ['cpufeatures_1653',['CpuFeatures',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga74405b66c7a701d17cec08a50b8b2802',1,]]], - ['crbegin_1654',['crbegin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aac8666029362e1d65769694f28f28d7a',1,'__gnu_cxx::__versa_string::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< _CharT >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< _CharT, _Traits, _Allocator >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< char >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< char, char_traits< char >, _Byte_alloc >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< char_type, _Traits, _Alloc >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< value_type >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a86674e16182ecb624e854ce7a653c03e',1,'deque< _StateSeqT >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ab0c1a4886327c94160ec35419c516f64',1,'list< __inp, __rebind_inp >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'match_results< _Bi_iter >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'std::basic_string::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a86674e16182ecb624e854ce7a653c03e',1,'std::deque::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ab0c1a4886327c94160ec35419c516f64',1,'std::list::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a68296cab04aadacb8da0b4bb1a8d8991',1,'std::map::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'std::match_results::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#aa3ac07de9d4cc6e2c434c3d258a8f3dc',1,'std::multimap::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a367f51af8d4d16af56b3c669808a80e9',1,'std::multiset::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aa748ce25c53c595cbb332058bf1841d3',1,'std::set::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'std::vector::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< __diff_type >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _CharClassT >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _CharT >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _Cmpt >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _Node *, _Nodeptr_Alloc >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _RealType >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _State< _TraitsT::char_type > >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _StringT >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< block_type, allocator_type >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< Catalog_info * >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< double >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< int >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< result_type >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< size_t >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< std::pair< _BiIter, int > >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< std::pair< _StateIdT, std::vector > >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< std::pair< _StrTransT, _StrTransT > >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< sub_match< _Bi_iter >, _Alloc >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< sub_match< _BiIter >, _Alloc >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'Eigen::VectorwiseOp::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const Derived, Horizontal >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const Derived, Vertical >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::crbegin()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a044298d189bdf7e4b36492de9811ddd6.html#a044298d189bdf7e4b36492de9811ddd6',1,'nlohmann::basic_json::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab429cfdfbcbf489aa4e0d1fbdd3e1c75',1,'std::crbegin()']]], - ['create_1655',['create',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a4eb2daf4732c371c7565db49f76c63ce',1,'cv::_OutputArray::create(Size sz, int type, int i=-1, bool allowTransposed=false, _OutputArray::DepthMask fixedDepthMask=static_cast< _OutputArray::DepthMask >(0)) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#abedc4c2ea80045d3d41624b2af00aafb',1,'cv::_OutputArray::create(int rows, int cols, int type, int i=-1, bool allowTransposed=false, _OutputArray::DepthMask fixedDepthMask=static_cast< _OutputArray::DepthMask >(0)) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a63bd2487f5d002496b4622f23e639ab0',1,'cv::_OutputArray::create(int dims, const int *size, int type, int i=-1, bool allowTransposed=false, _OutputArray::DepthMask fixedDepthMask=static_cast< _OutputArray::DepthMask >(0)) const'],['https://docs.opencv.org/4.2.0/d8/d2f/classcv_1_1dnn_1_1AbsLayer.html#ab8bb19eb78edb1a9c6772e209eb31672',1,'cv::dnn::AbsLayer::create()'],['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a348a6562644f9dd0f0ea60fc24439f0c',1,'cv::ximgproc::AdaptiveManifoldFilter::create()'],['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1xfeatures2d_1_1AffineFeature2D.html#a2e58c7e8e869557ad2c8554d24ea75a8',1,'cv::xfeatures2d::AffineFeature2D::create(Ptr< FeatureDetector > keypoint_detector, Ptr< DescriptorExtractor > descriptor_extractor)'],['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1xfeatures2d_1_1AffineFeature2D.html#acda5802af2e577b9785bea7caa57b5f8',1,'cv::xfeatures2d::AffineFeature2D::create(Ptr< FeatureDetector > keypoint_detector)'],['https://docs.opencv.org/4.2.0/d4/dd7/classcv_1_1AffineWarper.html#a4e4955b7ed94a2bd85bad297bec6ba03',1,'cv::AffineWarper::create()'],['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#af8c9c1af0be6d1ab7ad190aaf6c4a45c',1,'cv::AgastFeatureDetector::create()'],['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#aee9025aea852275a424e1b5934c79103',1,'cv::AKAZE::create()'],['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a1c78150f5117029c53d6ad3cdd61af4b',1,'cv::ml::ANN_MLP::create()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1datasets_1_1AR__hmdb.html#aed9e5b48de6b8ba98ce69401a2a533ef',1,'cv::datasets::AR_hmdb::create()'],['https://docs.opencv.org/4.2.0/d5/d36/classcv_1_1datasets_1_1AR__sports.html#a746c3ac273f516826fa2cd3ec390166e',1,'cv::datasets::AR_sports::create()'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1img__hash_1_1AverageHash.html#a0f4a331d4d894aa48c681738241ddd01',1,'cv::img_hash::AverageHash::create()'],['https://docs.opencv.org/4.2.0/d4/dd2/classcv_1_1dnn_1_1BatchNormLayer.html#a0e2cfac91bfe3217e33cb6221f506bd3',1,'cv::dnn::BatchNormLayer::create()'],['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#af3baaa252f5fb027ee1b6eec1c77bbb0',1,'cv::detail::BestOf2NearestMatcher::create()'],['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#ac6418c6f87e0e12a88979ea57980c020',1,'cv::BFMatcher::create()'],['https://docs.opencv.org/4.2.0/dc/d12/classcv_1_1face_1_1BIF.html#adbc6071f0190771339f4f105a5ed624c',1,'cv::face::BIF::create()'],['https://docs.opencv.org/4.2.0/d8/d2d/classcv_1_1dnn_1_1BlankLayer.html#aeae0845e9d3739c737db8ec31f1ec9f2',1,'cv::dnn::BlankLayer::create()'],['https://docs.opencv.org/4.2.0/df/d55/classcv_1_1img__hash_1_1BlockMeanHash.html#ac18b32b0585dd07302a5667458797338',1,'cv::img_hash::BlockMeanHash::create()'],['https://docs.opencv.org/4.2.0/d0/d87/classcv_1_1dnn_1_1BNLLLayer.html#ab1f388f3ee331d92974e3175c3660404',1,'cv::dnn::BNLLLayer::create()'],['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1aruco_1_1Board.html#a06243c9dcd6fedf32992388aa7527f59',1,'cv::aruco::Board::create()'],['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#ae06452dcc8245afa4b261443d10b1d5c',1,'cv::ml::Boost::create()'],['https://docs.opencv.org/4.2.0/d1/dfd/classcv_1_1xfeatures2d_1_1BoostDesc.html#ab780ad7e9332763ce44d2b1f53381f1c',1,'cv::xfeatures2d::BoostDesc::create()'],['https://docs.opencv.org/4.2.0/d1/d93/classcv_1_1xfeatures2d_1_1BriefDescriptorExtractor.html#ae3bc52666010fb137ab6f0d32de51f60',1,'cv::xfeatures2d::BriefDescriptorExtractor::create()'],['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html#accc52b237a3a251a12fc2d749291140b',1,'cv::BRISK::create(int thresh=30, int octaves=3, float patternScale=1.0f)'],['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html#a8c202bdb80ee1077d04cf64ed9045bf2',1,'cv::BRISK::create(const std::vector< float > &radiusList, const std::vector< int > &numberList, float dMax=5.85f, float dMin=8.2f, const std::vector< int > &indexChange=std::vector< int >())'],['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html#a6720ec157fa5608d0f439732a0ec4322',1,'cv::BRISK::create(int thresh, int octaves, const std::vector< float > &radiusList, const std::vector< int > &numberList, float dMax=5.85f, float dMin=8.2f, const std::vector< int > &indexChange=std::vector< int >())'],['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#afa8751d1156b7391318f736a535dd2fc',1,'cv::cuda::BroxOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a1b9eb33a14f929c8554b4444198a1550',1,'cv::ogl::Buffer::create(int arows, int acols, int atype, Target target=ARRAY_BUFFER, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a1ff29b1f3609d41cc350e5d407ddb9b1',1,'cv::ogl::Buffer::create(Size asize, int atype, Target target=ARRAY_BUFFER, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a44865bbb2f1c39635a63727f116fe740',1,'cv::cuda::CascadeClassifier::create(const String &filename)'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a9f1a80b86130ed1a50a46741012f9cf5',1,'cv::cuda::CascadeClassifier::create(const FileStorage &file)'],['https://docs.opencv.org/4.2.0/d7/de9/classcv_1_1dnn_1_1ChannelsPReLULayer.html#a323bc0edc5dd6acb8cea43d9cdc1b658',1,'cv::dnn::ChannelsPReLULayer::create()'],['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html#aa83b0a885d4dd137a41686991f85594c',1,'cv::aruco::CharucoBoard::create()'],['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a4c33b73248d4bb67e846510ca00b2eca',1,'cv::linemod::ColorGradient::create()'],['https://docs.opencv.org/4.2.0/df/d52/classcv_1_1img__hash_1_1ColorMomentHash.html#a09377732a355950187db4d5d38889dc2',1,'cv::img_hash::ColorMomentHash::create()'],['https://docs.opencv.org/4.2.0/de/d9a/classcv_1_1CompressedRectilinearPortraitWarper.html#ad188c78928224ebd87bdee7f214eb3ca',1,'cv::CompressedRectilinearPortraitWarper::create()'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1CompressedRectilinearWarper.html#a4a8a2e0f4f511e9f79fc7d117530652d',1,'cv::CompressedRectilinearWarper::create()'],['https://docs.opencv.org/4.2.0/da/d5c/classcv_1_1dnn_1_1ConcatLayer.html#a767fd49a5b2c8fda4705be6296e92b39',1,'cv::dnn::ConcatLayer::create()'],['https://docs.opencv.org/4.2.0/d0/d21/classcv_1_1ConjGradSolver.html#ad64e8d003cc3a6682b4fa7ab18c0c0e9',1,'cv::ConjGradSolver::create()'],['https://docs.opencv.org/4.2.0/de/dff/classcv_1_1dnn_1_1ConstLayer.html#aac2505cba10df25212d2724a0270512b',1,'cv::dnn::ConstLayer::create()'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a34a5de8c9951363ed10bc44813971d9b',1,'cv::ocl::Context::create()'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#ab2662240cf90de0069ed416557ffab93',1,'cv::ocl::Context::create(int dtype)'],['https://docs.opencv.org/4.2.0/d5/dcf/classcv_1_1dnn_1_1ConvolutionLayer.html#a1bab8014819795c973bbf192a7e3633d',1,'cv::dnn::ConvolutionLayer::create()'],['https://docs.opencv.org/4.2.0/d8/d53/classcv_1_1dnn_1_1CropAndResizeLayer.html#a8a42c6fa064f2071f58954c7723bd033',1,'cv::dnn::CropAndResizeLayer::create()'],['https://docs.opencv.org/4.2.0/d7/d86/classcv_1_1dnn_1_1CropLayer.html#a983ab75ad1f93c88e69eddec3bb8f7eb',1,'cv::dnn::CropLayer::create()'],['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#ac416a191477271c2481a1a2909172bce',1,'cv::ccalib::CustomPattern::create()'],['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a9b7ec7edbacb2cac32864513c8f73a96',1,'cv::CvFeatureEvaluator::create()'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#a2d41f24d666a64c85a6e38f73b3bec16',1,'cv::CvFeatureParams::create()'],['https://docs.opencv.org/4.2.0/d7/df6/classcv_1_1CylindricalWarper.html#a31013639d54dd58e47b9d03cc1ec3af6',1,'cv::CylindricalWarper::create()'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#a0be8f50673d543be7ce581ffb7b16742',1,'cv::xfeatures2d::DAISY::create()'],['https://docs.opencv.org/4.2.0/d5/d57/structcv_1_1hal_1_1DCT2D.html#ac24f4a880fb0dab10404dcf7c3231690',1,'cv::hal::DCT2D::create()'],['https://docs.opencv.org/4.2.0/dd/d77/classcv_1_1dnn_1_1DeconvolutionLayer.html#afb33ba7ef29c564786191767d0512bdd',1,'cv::dnn::DeconvolutionLayer::create()'],['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1cuda_1_1DensePyrLKOpticalFlow.html#a0a8d7a0a39701e77bb6b905b73269a2a',1,'cv::cuda::DensePyrLKOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#abf0499ae92a0247cb78f28ebf66188a1',1,'cv::optflow::DenseRLOFOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a5ce7f4245a686a168335f1bc477eaf86',1,'cv::rgbd::DepthCleaner::create()'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a9a4f23de5282e49bb086ff4ea04315b2',1,'cv::linemod::DepthNormal::create()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#ab5dc5036569ecc8d47565007fa518257',1,'cv::DescriptorMatcher::create(const String &descriptorMatcherType)'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a13441ee7098af71be2a55453288360f7',1,'cv::DescriptorMatcher::create(const DescriptorMatcher::MatcherType &matcherType)'],['https://docs.opencv.org/4.2.0/da/dbd/classcv_1_1dnn_1_1DetectionOutputLayer.html#a5be4fc85b12791f9fbfb4324ebb567c7',1,'cv::dnn::DetectionOutputLayer::create()'],['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#aca7a04c0d23b3e1c575e11af697d506c',1,'cv::aruco::DetectorParameters::create()'],['https://docs.opencv.org/4.2.0/d8/d03/structcv_1_1hal_1_1DFT1D.html#aad0ee3322c93042bc23ce8b8c6935ea2',1,'cv::hal::DFT1D::create()'],['https://docs.opencv.org/4.2.0/d6/d77/structcv_1_1hal_1_1DFT2D.html#a830cbb18030e234bceb9a6a3d2931900',1,'cv::hal::DFT2D::create()'],['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a30601d33b623a8faa865d2ae68438624',1,'cv::aruco::Dictionary::create(int nMarkers, int markerSize, int randomSeed=0)'],['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a6d5e1f226078215325731aaecd3e5046',1,'cv::aruco::Dictionary::create(int nMarkers, int markerSize, const Ptr< Dictionary > &baseDictionary, int randomSeed=0)'],['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#ac7190baea143466f303b7778d20b0ceb',1,'cv::DISOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d4/d43/classcv_1_1DownhillSolver.html#a9ef15380f5843cd4ccd9b4f3308ce0de',1,'cv::DownhillSolver::create()'],['https://docs.opencv.org/4.2.0/df/dba/classcv_1_1dpm_1_1DPMDetector.html#a712520d7ac7405227cd64f359c04e2ac',1,'cv::dpm::DPMDetector::create()'],['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#aa0ae71ed85f63d2ea809402c0f19d602',1,'cv::ml::DTrees::create()'],['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a6a86c0b4c94c589ebc55d28da803fa60',1,'cv::optflow::DualTVL1OpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d1/d20/classcv_1_1dynafu_1_1DynaFu.html#a0646f5d28318cdc7495246a871f98a76',1,'cv::dynafu::DynaFu::create()'],['https://docs.opencv.org/4.2.0/dd/d7c/classcv_1_1face_1_1EigenFaceRecognizer.html#a5ccb5a03dd0d8fb828f17670d9d28f68',1,'cv::face::EigenFaceRecognizer::create()'],['https://docs.opencv.org/4.2.0/d6/d6a/classcv_1_1dnn_1_1EltwiseLayer.html#a46904069ed54f077696323d5c7723b95',1,'cv::dnn::EltwiseLayer::create()'],['https://docs.opencv.org/4.2.0/df/da5/classcv_1_1dnn_1_1ELULayer.html#a16b75ffaef498f855dbe2eb05ba18366',1,'cv::dnn::ELULayer::create()'],['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a7725c8beba696cfcb6889cd5494101a4',1,'cv::ml::EM::create()'],['https://docs.opencv.org/4.2.0/d5/d7b/classcv_1_1face_1_1FacemarkAAM.html#abbb9fb9370f36723ea49b318a15f27e9',1,'cv::face::FacemarkAAM::create()'],['https://docs.opencv.org/4.2.0/dc/de0/classcv_1_1face_1_1FacemarkKazemi.html#a2a332234ec780b70e6b94cb71008650b',1,'cv::face::FacemarkKazemi::create()'],['https://docs.opencv.org/4.2.0/dc/d63/classcv_1_1face_1_1FacemarkLBF.html#a9b67c4e35ffb36f58055b5af006b4b46',1,'cv::face::FacemarkLBF::create()'],['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#a4ce7a192171d340ea19e1fd670b231e7',1,'cv::FarnebackOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#aad66690bde57b2e926c6166cbcdae3ec',1,'cv::cuda::FarnebackOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#ab986f2ff8f8778aab1707e2642bc7f8e',1,'cv::FastFeatureDetector::create()'],['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#a1732526616df9ce7180fe6c067e05336',1,'cv::cuda::FastFeatureDetector::create()'],['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a774050fcb4b494a12e39131e016b449b',1,'cv::rgbd::FastICPOdometry::create()'],['https://docs.opencv.org/4.2.0/d2/de9/classcv_1_1face_1_1FisherFaceRecognizer.html#a0072e4c3f410250baf4b083296a41dfc',1,'cv::face::FisherFaceRecognizer::create()'],['https://docs.opencv.org/4.2.0/d5/d30/classcv_1_1FisheyeWarper.html#a99e8ac52f719086bfd3ac9c9c894cb92',1,'cv::FisheyeWarper::create()'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a7b17083dda906384465a32952c1bbe3b',1,'cv::FlannBasedMatcher::create()'],['https://docs.opencv.org/4.2.0/d4/da3/classcv_1_1dnn_1_1FlattenLayer.html#a92652ef49764bfabdbb86f79a8c7fdfb',1,'cv::dnn::FlattenLayer::create()'],['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1datasets_1_1FR__adience.html#ad107bd9a464f9743c95228e248026ec2',1,'cv::datasets::FR_adience::create()'],['https://docs.opencv.org/4.2.0/dd/dda/classcv_1_1datasets_1_1FR__lfw.html#aa263526104331585d43bb1727970a083',1,'cv::datasets::FR_lfw::create()'],['https://docs.opencv.org/4.2.0/df/db4/classcv_1_1xfeatures2d_1_1FREAK.html#a5abaecbd4071beae0284ff31462ba740',1,'cv::xfeatures2d::FREAK::create()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#a99865287feeb2dc1d75ab464e2fc1816',1,'cv::GFTTDetector::create(int maxCorners=1000, double qualityLevel=0.01, double minDistance=1, int blockSize=3, bool useHarrisDetector=false, double k=0.04)'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#ad72873253d5f6a5383a2bee0842c0fdd',1,'cv::GFTTDetector::create(int maxCorners, double qualityLevel, double minDistance, int blockSize, int gradiantSize, bool useHarrisDetector=false, double k=0.04)'],['https://docs.opencv.org/4.2.0/da/dfe/classcv_1_1optflow_1_1GPCForest.html#a8b6a8c989b75973f38bd8430109020d8',1,'cv::optflow::GPCForest::create()'],['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#ab459320809d8dddfc52daa043a97ef17',1,'cv::optflow::GPCTrainingSamples::create(const std::vector< String > &imagesFrom, const std::vector< String > &imagesTo, const std::vector< String > &gt, int descriptorType)'],['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#a2c8acd882c63416242c4b281d134cd1b',1,'cv::optflow::GPCTrainingSamples::create(InputArrayOfArrays imagesFrom, InputArrayOfArrays imagesTo, InputArrayOfArrays gt, int descriptorType)'],['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#aa806635cbfeb63d0d9fb2e12c6104bbf',1,'cv::optflow::GPCTree::create()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#af21454929f3efba4c783edbc27042200',1,'cv::cuda::GpuMat::create(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#af88f29d92f6fc2c29cd6ff8960954d4e',1,'cv::cuda::GpuMat::create(Size size, int type)'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a9d88407df08c49f1de5d2d062099c1fc',1,'cv::cudev::GpuMat_::create(int arows, int acols)'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a08a2c5d06291bf4ef516b3a835b2c5eb',1,'cv::cudev::GpuMat_::create(Size asize)'],['https://docs.opencv.org/4.2.0/d9/d14/classcv_1_1datasets_1_1GR__chalearn.html#ae6a896a530e25a3b1128db2ec0d75edf',1,'cv::datasets::GR_chalearn::create()'],['https://docs.opencv.org/4.2.0/d0/deb/classcv_1_1datasets_1_1GR__skig.html#a29b02a5c7a97e93502cfea349d4241cf',1,'cv::datasets::GR_skig::create()'],['https://docs.opencv.org/4.2.0/dc/d4c/classcv_1_1detail_1_1Graph.html#a36812f283b56ba6cbeec3cf3c3db3883',1,'cv::detail::Graph::create()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1structured__light_1_1GrayCodePattern.html#a1f724251afc61fc2d6f7451721cb90fe',1,'cv::structured_light::GrayCodePattern::create(const GrayCodePattern::Params &parameters=GrayCodePattern::Params())'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1structured__light_1_1GrayCodePattern.html#a5b46328443303203abae2d77902002be',1,'cv::structured_light::GrayCodePattern::create(int width, int height)'],['https://docs.opencv.org/4.2.0/de/d05/classcv_1_1aruco_1_1GridBoard.html#a8f4db0a7faad559753887e9fdd43b74c',1,'cv::aruco::GridBoard::create()'],['https://docs.opencv.org/4.2.0/d8/d94/structHaarClassifierNodeDescriptor32.html#aa7153a73228bb6ab0a744f21fd959d12',1,'HaarClassifierNodeDescriptor32::create(Ncv32f leafValue)'],['https://docs.opencv.org/4.2.0/d8/d94/structHaarClassifierNodeDescriptor32.html#a7b647bfc12d5b55c232757492181eb9c',1,'HaarClassifierNodeDescriptor32::create(Ncv32u offsetHaarClassifierNode)'],['https://docs.opencv.org/4.2.0/df/d88/structHaarFeatureDescriptor32.html#aeec844e6d66283286eef0a66cbdc49ba',1,'HaarFeatureDescriptor32::create()'],['https://docs.opencv.org/4.2.0/d1/dad/classcv_1_1xfeatures2d_1_1HarrisLaplaceFeatureDetector.html#a4d0fa401f934e253905a712668cb5ab8',1,'cv::xfeatures2d::HarrisLaplaceFeatureDetector::create()'],['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#a8078fb9b69bbe2f23556055545ed3a20',1,'cv::hfs::HfsSegment::create()'],['https://docs.opencv.org/4.2.0/d5/d7d/classcv_1_1phase__unwrapping_1_1HistogramPhaseUnwrapping.html#a36b20dc34658c5cff6790775f949187f',1,'cv::phase_unwrapping::HistogramPhaseUnwrapping::create()'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#aa652085c609b2b581bda30d76ae7539c',1,'cv::cuda::HOG::create()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a62eea66ac1a181eeeb10a2335f3bd4bd',1,'cv::cuda::HostMem::create(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a451a57a38885d605a95b4c965dd17ea7',1,'cv::cuda::HostMem::create(Size size, int type)'],['https://docs.opencv.org/4.2.0/d5/d42/classcv_1_1datasets_1_1HPE__humaneva.html#a702148fea981bf309ab4c79dda174388',1,'cv::datasets::HPE_humaneva::create()'],['https://docs.opencv.org/4.2.0/d6/d72/classcv_1_1datasets_1_1HPE__parse.html#aa4cc0a584c4b8630d8938773bd75a9bc',1,'cv::datasets::HPE_parse::create()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a3feee81430880a96fc10012468630898',1,'cv::rgbd::ICPOdometry::create()'],['https://docs.opencv.org/4.2.0/d0/dc7/classcv_1_1dnn_1_1InnerProductLayer.html#a0cb7cc22dcb0ae5d0a6468001f8e4072',1,'cv::dnn::InnerProductLayer::create()'],['https://docs.opencv.org/4.2.0/de/d56/classcv_1_1dnn_1_1InterpLayer.html#a60e9eb9326afe31febbffebd6b33e312',1,'cv::dnn::InterpLayer::create()'],['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1datasets_1_1IR__affine.html#a94df8161488e79d2bf86b043716ae8d9',1,'cv::datasets::IR_affine::create()'],['https://docs.opencv.org/4.2.0/d7/d5f/classcv_1_1datasets_1_1IR__robot.html#a3905bb399c36bad29ba5d949e9245de7',1,'cv::datasets::IR_robot::create()'],['https://docs.opencv.org/4.2.0/dd/d0e/classcv_1_1datasets_1_1IS__bsds.html#aa5d9f593cb9b4818c3bbe1510c43ed9a',1,'cv::datasets::IS_bsds::create()'],['https://docs.opencv.org/4.2.0/d9/dbe/classcv_1_1datasets_1_1IS__weizmann.html#aec27ca107ef45582526c2a6462e7184a',1,'cv::datasets::IS_weizmann::create()'],['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a9e8ebcb7cde56b3131c25cdbbb767a0b',1,'cv::KAZE::create()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#af4c66ae727523e0a1155b9837848e8a6',1,'cv::ocl::Kernel::create(const char *kname, const Program &prog)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#ad9374801e94cbfdabdd121e59d1abd73',1,'cv::ocl::Kernel::create(const char *kname, const ProgramSource &prog, const String &buildopts, String *errmsg=0)'],['https://docs.opencv.org/4.2.0/d8/d1f/classcv_1_1kinfu_1_1KinFu.html#a38c83d66127a82beaa464f05d44a2cb7',1,'cv::kinfu::KinFu::create()'],['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#ab0ce3fa7a242f3418938592f4d935b81',1,'cv::ml::KNearest::create()'],['https://docs.opencv.org/4.2.0/d6/d36/classcv_1_1xfeatures2d_1_1LATCH.html#a294058d2dd2666abf59fa384bde2bf22',1,'cv::xfeatures2d::LATCH::create()'],['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html#ac33ba992b16f29f2824761cea5cd5fc5',1,'cv::face::LBPHFaceRecognizer::create()'],['https://docs.opencv.org/4.2.0/d3/d6d/classcv_1_1LMSolver.html#a1f975ab807b33c5ad0c8dc07eadad87b',1,'cv::LMSolver::create(const Ptr< LMSolver::Callback > &cb, int maxIters)'],['https://docs.opencv.org/4.2.0/d3/d6d/classcv_1_1LMSolver.html#a102fa94402b7362440c49cd3213b6fe4',1,'cv::LMSolver::create(const Ptr< LMSolver::Callback > &cb, int maxIters, double eps)'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#ac123770c861631c2013aeebb677c0334',1,'cv::ml::LogisticRegression::create()'],['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#ab41522a7199f6fc4115621afe1766e8a',1,'cv::dnn::LRNLayer::create()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a853f56566ef46d7d4cd9e20e3d4a0798',1,'cv::dnn::LSTMLayer::create()'],['https://docs.opencv.org/4.2.0/d4/d86/classcv_1_1xfeatures2d_1_1LUCID.html#a293e536a14982e2b3d7da85e58c7cd7e',1,'cv::xfeatures2d::LUCID::create()'],['https://docs.opencv.org/4.2.0/d9/d5c/classcv_1_1face_1_1MACE.html#a2a088a5660f6f1ed7bd4e4881e9c4016',1,'cv::face::MACE::create()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1img__hash_1_1MarrHildrethHash.html#a0a198a58d4a95ede0eb7db951352e062',1,'cv::img_hash::MarrHildrethHash::create()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a55ced2c8d844d683ea9a725c60037ad0',1,'cv::Mat::create(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a48409946d0e1bebb40fe765e18ec5eea',1,'cv::Mat::create(Size size, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aee53524ac61fa2ba441c4f29c3aca93f',1,'cv::Mat::create(int ndims, const int *sizes, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a84f35d3923a92251631329eed66d2a12',1,'cv::Mat::create(const std::vector< int > &sizes, int type)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#aa234313065f8e7c8b333266dbb668a76',1,'cv::gapi::own::Mat::create(int _rows, int _cols, int _type)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#ae227aa0c16173d8f84f6c15a77fa73da',1,'cv::gapi::own::Mat::create(Size _size, int _type)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#ae4976c95392f50a7acb730cf192dd170',1,'cv::gapi::own::Mat::create(const std::vector< int > &_dims, int _type)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#adce382b8089699ea55fdbee77fe76ddb',1,'cv::Mat_::create(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a393ab12ff9e6647af7b70bff1eb6f91c',1,'cv::Mat_::create(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a63fa6dee6ca14f83a49d641fabcb8a69',1,'cv::Mat_::create(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#adce382b8089699ea55fdbee77fe76ddb',1,'Mat_< double >::create(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a393ab12ff9e6647af7b70bff1eb6f91c',1,'Mat_< double >::create(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a63fa6dee6ca14f83a49d641fabcb8a69',1,'Mat_< double >::create(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#adce382b8089699ea55fdbee77fe76ddb',1,'Mat_< float >::create(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a393ab12ff9e6647af7b70bff1eb6f91c',1,'Mat_< float >::create(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a63fa6dee6ca14f83a49d641fabcb8a69',1,'Mat_< float >::create(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#adce382b8089699ea55fdbee77fe76ddb',1,'Mat_< uchar >::create(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a393ab12ff9e6647af7b70bff1eb6f91c',1,'Mat_< uchar >::create(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a63fa6dee6ca14f83a49d641fabcb8a69',1,'Mat_< uchar >::create(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#adce382b8089699ea55fdbee77fe76ddb',1,'Mat_< unsigned char >::create(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a393ab12ff9e6647af7b70bff1eb6f91c',1,'Mat_< unsigned char >::create(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a63fa6dee6ca14f83a49d641fabcb8a69',1,'Mat_< unsigned char >::create(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html#abcb79e3d0bf5e2e1b670196035d69777',1,'cv::dnn::MaxUnpoolLayer::create()'],['https://docs.opencv.org/4.2.0/de/d04/classcv_1_1MercatorWarper.html#ac3107ac6dfdbba0724475c6819c64fd2',1,'cv::MercatorWarper::create()'],['https://docs.opencv.org/4.2.0/d4/da1/classcv_1_1dnn_1_1MishLayer.html#a435c8f70e356be5790a77ae9bdcb7a12',1,'cv::dnn::MishLayer::create()'],['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html#aa6e6d3c9b5a672e4019c215d50f0e0d2',1,'cv::linemod::Modality::create(const String &modality_type)'],['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html#af89910d21ad063495b76526fc451ac54',1,'cv::linemod::Modality::create(const FileNode &fn)'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a11bb217263bb00d7330777286e481e04',1,'cv::saliency::MotionSaliencyBinWangApr2014::create()'],['https://docs.opencv.org/4.2.0/d0/dcf/classcv_1_1xfeatures2d_1_1MSDDetector.html#a8a3346e89e45bab5f53f67a525431b9d',1,'cv::xfeatures2d::MSDDetector::create()'],['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#a136c6b29fbcdd783a1003bf429fa17ed',1,'cv::MSER::create()'],['https://docs.opencv.org/4.2.0/dc/de4/classcv_1_1datasets_1_1MSM__epfl.html#ab63f6a7099dffccf4727681977f84eaa',1,'cv::datasets::MSM_epfl::create()'],['https://docs.opencv.org/4.2.0/d2/dcc/classcv_1_1datasets_1_1MSM__middlebury.html#adcc1a53b9655d1ad5225923256d95246',1,'cv::datasets::MSM_middlebury::create()'],['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html#a64436fb8ab6b1a88b33a12d0f3c81c5c',1,'cv::MultiTracker::create()'],['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html#a37f8e98fc8ee17db7e2f1fe86c2ed3bb',1,'cv::dnn::MVNLayer::create()'],['https://docs.opencv.org/4.2.0/d4/d8e/classcv_1_1ml_1_1NormalBayesClassifier.html#a785df31a648deca899a5d6ee56bcdab0',1,'cv::ml::NormalBayesClassifier::create()'],['https://docs.opencv.org/4.2.0/dc/df8/classcv_1_1dnn_1_1NormalizeBBoxLayer.html#a85a126cc438a2b901aa4784ba2494c42',1,'cv::dnn::NormalizeBBoxLayer::create()'],['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a83b080591b5f2b744352261ce4709d7e',1,'cv::cuda::NvidiaOpticalFlow_1_0::create()'],['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#afa994cae12d287aaa5a2c9eafab52cba',1,'cv::saliency::ObjectnessBING::create()'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a394a90c411fd7b8717b3295b95102cb4',1,'cv::text::OCRBeamSearchDecoder::create(const Ptr< OCRBeamSearchDecoder::ClassifierCallback > classifier, const std::string &vocabulary, InputArray transition_probabilities_table, InputArray emission_probabilities_table, decoder_mode mode=OCR_DECODER_VITERBI, int beam_size=500)'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#ac6a5b37be75f3c891c0dcc194e86972e',1,'cv::text::OCRBeamSearchDecoder::create(const Ptr< OCRBeamSearchDecoder::ClassifierCallback > classifier, const String &vocabulary, InputArray transition_probabilities_table, InputArray emission_probabilities_table, int mode=OCR_DECODER_VITERBI, int beam_size=500)'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a01b6739f657ddf0c53135f1c370cbb7d',1,'cv::text::OCRBeamSearchDecoder::create(const String &filename, const String &vocabulary, InputArray transition_probabilities_table, InputArray emission_probabilities_table, int mode=OCR_DECODER_VITERBI, int beam_size=500)'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a5ba05f246ceb4197294b86c1acc1f2e4',1,'cv::text::OCRHMMDecoder::create(const Ptr< OCRHMMDecoder::ClassifierCallback > classifier, const String &vocabulary, InputArray transition_probabilities_table, InputArray emission_probabilities_table, int mode=OCR_DECODER_VITERBI)'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a785259e52d2041f46f8f0ee510f1f974',1,'cv::text::OCRHMMDecoder::create(const String &filename, const String &vocabulary, InputArray transition_probabilities_table, InputArray emission_probabilities_table, int mode=OCR_DECODER_VITERBI, int classifier=OCR_KNN_CLASSIFIER)'],['https://docs.opencv.org/4.2.0/d0/d8f/classcv_1_1text_1_1OCRHolisticWordRecognizer.html#a37f077897f3f03a7f4094be5f4b5eb41',1,'cv::text::OCRHolisticWordRecognizer::create()'],['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html#a391b1e753f0b779b72204ec15200a99a',1,'cv::text::OCRTesseract::create()'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a7763a1c1ffaff84eb3de6b6c83d157af',1,'cv::rgbd::Odometry::create()'],['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#aa77e3cf9fbea8b6dec0a5f450db5efa9',1,'cv::rgbd::OdometryFrame::create()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#af630800c27534d7d0df7c7a335207c64',1,'cv::cuda::OpticalFlowDual_TVL1::create()'],['https://docs.opencv.org/4.2.0/db/df7/classcv_1_1datasets_1_1OR__imagenet.html#a9a53a25b8cc24d7b6c8bc4394ba93ce6',1,'cv::datasets::OR_imagenet::create()'],['https://docs.opencv.org/4.2.0/d9/d92/classcv_1_1datasets_1_1OR__mnist.html#a286c06a100a62607a853b9ade1104144',1,'cv::datasets::OR_mnist::create()'],['https://docs.opencv.org/4.2.0/d4/d7e/classcv_1_1datasets_1_1OR__pascal.html#a3516c64e875b6d46c56689012fdb03ae',1,'cv::datasets::OR_pascal::create()'],['https://docs.opencv.org/4.2.0/da/d69/classcv_1_1datasets_1_1OR__sun.html#a4dca609bd43c4a5dcd8302d0c1f4c091',1,'cv::datasets::OR_sun::create()'],['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#aeff0cbe668659b7ca14bb85ff1c4073b',1,'cv::ORB::create()'],['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#a305d0dab874e77a9c991fbc007a7aa22',1,'cv::cuda::ORB::create()'],['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1dnn_1_1PaddingLayer.html#abdb8e6e3739fea23b742293c7741f342',1,'cv::dnn::PaddingLayer::create()'],['https://docs.opencv.org/4.2.0/d0/d8b/classcv_1_1PaniniPortraitWarper.html#aca41525cfdac6d3031869ddb379ed234',1,'cv::PaniniPortraitWarper::create()'],['https://docs.opencv.org/4.2.0/dd/db0/classcv_1_1PaniniWarper.html#a702fdddd7659428c357e243475536c45',1,'cv::PaniniWarper::create()'],['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a0f7cb2424b2a1f5c45670b20c83acc96',1,'cv::ml::ParamGrid::create()'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a9e2ff603a2706f9a64aa00aa7acd6b5a',1,'cv::xfeatures2d::PCTSignatures::create(const int initSampleCount=2000, const int initSeedCount=400, const int pointDistribution=0)'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a562a030ed45731adba1a1954270c6825',1,'cv::xfeatures2d::PCTSignatures::create(const std::vector< Point2f > &initSamplingPoints, const int initSeedCount)'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a77aa42e4c641f25c33aa9355f8b11352',1,'cv::xfeatures2d::PCTSignatures::create(const std::vector< Point2f > &initSamplingPoints, const std::vector< int > &initClusterSeedIndexes)'],['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1xfeatures2d_1_1PCTSignaturesSQFD.html#a29ddb040ed05692854dd7be8acd2c7bd',1,'cv::xfeatures2d::PCTSignaturesSQFD::create()'],['https://docs.opencv.org/4.2.0/da/d8d/classcv_1_1datasets_1_1PD__caltech.html#a248c578856c0ad7bfb2d5da6d38fcc69',1,'cv::datasets::PD_caltech::create()'],['https://docs.opencv.org/4.2.0/d2/d61/classcv_1_1datasets_1_1PD__inria.html#a70ae2dbe64a9d08d3c97f14ea607d984',1,'cv::datasets::PD_inria::create()'],['https://docs.opencv.org/4.2.0/d2/d3c/classcv_1_1dnn_1_1PermuteLayer.html#a9a7cc466f5feadb96ef33c839e50e960',1,'cv::dnn::PermuteLayer::create()'],['https://docs.opencv.org/4.2.0/df/d4e/classcv_1_1img__hash_1_1PHash.html#a5dc7f32d7c0777b2d2c046b66d26ba8a',1,'cv::img_hash::PHash::create()'],['https://docs.opencv.org/4.2.0/d0/d57/classcv_1_1PlaneWarper.html#a77bb27e6bc4cf8d6e86c66e2885b86f0',1,'cv::PlaneWarper::create()'],['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a93bcea87b6c2e6dfcd64c909ac62b48a',1,'cv::plot::Plot2d::create(InputArray data)'],['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a52199a521d4e83c402acecd577f6c0ab',1,'cv::plot::Plot2d::create(InputArray dataX, InputArray dataY)'],['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#add7f134057686c59f09735d1290a2483',1,'cv::dnn::PoolingLayer::create()'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1dnn_1_1PowerLayer.html#acda0d129ec298d5918acb13616d246a6',1,'cv::dnn::PowerLayer::create()'],['https://docs.opencv.org/4.2.0/da/d1e/classcv_1_1dnn_1_1PriorBoxLayer.html#aec3c9b650bc5eb337b91e3343c1e06b4',1,'cv::dnn::PriorBoxLayer::create()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#aefabbfce0ead62656025b1765422d612',1,'cv::ocl::Program::create()'],['https://docs.opencv.org/4.2.0/da/d6b/classcv_1_1dnn_1_1ProposalLayer.html#ad3caa47b7735e1a62bc800f0fa79b0e8',1,'cv::dnn::ProposalLayer::create()'],['https://docs.opencv.org/4.2.0/d8/d99/classcv_1_1quality_1_1QualityBRISQUE.html#a5bb32aad7250b41a13c219f257654ef5',1,'cv::quality::QualityBRISQUE::create(const cv::String &model_file_path, const cv::String &range_file_path)'],['https://docs.opencv.org/4.2.0/d8/d99/classcv_1_1quality_1_1QualityBRISQUE.html#ad13a4961246174bf46affa1c55155e6e',1,'cv::quality::QualityBRISQUE::create(const cv::Ptr< cv::ml::SVM > &model, const cv::Mat &range)'],['https://docs.opencv.org/4.2.0/d8/d81/classcv_1_1quality_1_1QualityGMSD.html#ac7681a5eeb9cf9ade707acafcb728b52',1,'cv::quality::QualityGMSD::create()'],['https://docs.opencv.org/4.2.0/d7/d80/classcv_1_1quality_1_1QualityMSE.html#a369b3cea228b51e5114859998f453019',1,'cv::quality::QualityMSE::create()'],['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#a7f1172097d71d88a43df6e1a3d1dd09a',1,'cv::quality::QualityPSNR::create()'],['https://docs.opencv.org/4.2.0/d9/db5/classcv_1_1quality_1_1QualitySSIM.html#a6923ba31a5e69f61f4937843d9549adf',1,'cv::quality::QualitySSIM::create()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga67a1543e567dbfaa0b05630951caac2b',1,'cv::stereo::QuasiDenseStereo::create()'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a0f1172e0870daae02565f852e493a578',1,'cv::ocl::Queue::create()'],['https://docs.opencv.org/4.2.0/d5/d97/classcv_1_1img__hash_1_1RadialVarianceHash.html#afe5442f5e86d02ca44f14a8026c021fb',1,'cv::img_hash::RadialVarianceHash::create()'],['https://docs.opencv.org/4.2.0/d1/d21/classcv_1_1dnn_1_1RegionLayer.html#a8607d79b8dd79d6573c221c33f362290',1,'cv::dnn::RegionLayer::create()'],['https://docs.opencv.org/4.2.0/dc/dcd/classcv_1_1dnn_1_1ReLU6Layer.html#aede70730a8dfbb2ff0b0741ffc9f807c',1,'cv::dnn::ReLU6Layer::create()'],['https://docs.opencv.org/4.2.0/dd/df0/classcv_1_1dnn_1_1ReLULayer.html#a637030d31dce95e9f3ca33b39b5752d4',1,'cv::dnn::ReLULayer::create()'],['https://docs.opencv.org/4.2.0/d6/da3/classcv_1_1dnn_1_1ReorgLayer.html#a0b0fba10e5526149f952f468e2b2caab',1,'cv::dnn::ReorgLayer::create()'],['https://docs.opencv.org/4.2.0/db/d15/classcv_1_1dnn_1_1ReshapeLayer.html#aab80c00f9c0ed695858592775f49dc0b',1,'cv::dnn::ReshapeLayer::create()'],['https://docs.opencv.org/4.2.0/db/d38/classcv_1_1dnn_1_1ResizeLayer.html#ab6ace17a47e625459017cdba7092452f',1,'cv::dnn::ResizeLayer::create()'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a5089c21c98da9e7ccf0a6896e7d6a400',1,'cv::bioinspired::Retina::create(Size inputSize)'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a689eb94c4d177294f3fcc21612a60312',1,'cv::bioinspired::Retina::create(Size inputSize, const bool colorMode, int colorSamplingMethod=RETINA_COLOR_BAYER, const bool useRetinaLogSampling=false, const float reductionFactor=1.0f, const float samplingStrenght=10.0f)'],['https://docs.opencv.org/4.2.0/dd/d73/classcv_1_1bioinspired_1_1RetinaFastToneMapping.html#abfb3992c9c153320986fc21e2c005d62',1,'cv::bioinspired::RetinaFastToneMapping::create()'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#ac1756dbf37adeaa6aa8f1c42495aa99d',1,'cv::rgbd::RgbdFrame::create()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a05db54983c3635cd0a9219c0daa556b5',1,'cv::rgbd::RgbdICPOdometry::create()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a601c3cf90497731fe74995a2a977b026',1,'cv::rgbd::RgbdNormals::create()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a218fb178f66322e765281ceed04d6261',1,'cv::rgbd::RgbdOdometry::create()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a5527911bc5018b8a6aefa8d6bc1c13fe',1,'cv::rgbd::RgbdPlane::create()'],['https://docs.opencv.org/4.2.0/d4/d36/classcv_1_1ximgproc_1_1RidgeDetectionFilter.html#a64b8608420e891b338d72d09b3b5df49',1,'cv::ximgproc::RidgeDetectionFilter::create()'],['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#ab924694c071f1b173277c3c70453b087',1,'cv::optflow::RLOFOpticalFlowParameter::create()'],['https://docs.opencv.org/4.2.0/dd/dfd/classcv_1_1dnn_1_1RNNLayer.html#abc9954a46911f411abc280adf5fb3c52',1,'cv::dnn::RNNLayer::create()'],['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html#a39dae109b823a296bb7077d99970e664',1,'cv::ml::RTrees::create()'],['https://docs.opencv.org/4.2.0/dd/dde/classcv_1_1dnn_1_1ScaleLayer.html#a7adc86c3e8c4b46a5e8aae53244e7384',1,'cv::dnn::ScaleLayer::create()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#a329dd5053cbde7352ab071ad2ccc295e',1,'cv::sfm::SFMLibmvEuclideanReconstruction::create()'],['https://docs.opencv.org/4.2.0/d3/dd8/classcv_1_1dnn_1_1ShiftLayer.html#a2911784b21f90f0233650a41030e4619',1,'cv::dnn::ShiftLayer::create()'],['https://docs.opencv.org/4.2.0/de/d24/classcv_1_1dnn_1_1ShuffleChannelLayer.html#a3d2eb60bba760dbaca899dd6a9f695c5',1,'cv::dnn::ShuffleChannelLayer::create()'],['https://docs.opencv.org/4.2.0/d5/d3c/classcv_1_1xfeatures2d_1_1SIFT.html#a865f4dee68820970872c46241437f9cd',1,'cv::xfeatures2d::SIFT::create()'],['https://docs.opencv.org/4.2.0/dc/d09/classcv_1_1dnn_1_1SigmoidLayer.html#ae1cd5bb216f10da21110269155a9fcc9',1,'cv::dnn::SigmoidLayer::create()'],['https://docs.opencv.org/4.2.0/d0/d7a/classcv_1_1SimpleBlobDetector.html#a1d7a06c8b8749207a978e42cd8d0cdf6',1,'cv::SimpleBlobDetector::create()'],['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1structured__light_1_1SinusoidalPattern.html#a97045af313f2fa0fa68b12734cf48320',1,'cv::structured_light::SinusoidalPattern::create()'],['https://docs.opencv.org/4.2.0/d6/d92/classcv_1_1datasets_1_1SLAM__kitti.html#a058d6b419bc578a20bd45f35ddc4534c',1,'cv::datasets::SLAM_kitti::create()'],['https://docs.opencv.org/4.2.0/da/d91/classcv_1_1datasets_1_1SLAM__tumindoor.html#aa129a4bcd6c8d06c680d4db54a5762d3',1,'cv::datasets::SLAM_tumindoor::create()'],['https://docs.opencv.org/4.2.0/de/d61/classcv_1_1dnn_1_1SliceLayer.html#ab71bf5df3d57ff38a5e12badd6d5a087',1,'cv::dnn::SliceLayer::create()'],['https://docs.opencv.org/4.2.0/d8/d18/classcv_1_1dnn_1_1SoftmaxLayer.html#acc92a20152fc28368feb8095757727a0',1,'cv::dnn::SoftmaxLayer::create()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#adf2713a5ec1fb025c9ff4014a53e68c6',1,'cv::SparseMat::create()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a18a20736ff3a669e99e041d1c4fa7110',1,'cv::SparseMat_::create()'],['https://docs.opencv.org/4.2.0/d7/d05/classcv_1_1cuda_1_1SparsePyrLKOpticalFlow.html#a96b4a66c28a3d345768a777e03dc0eab',1,'cv::cuda::SparsePyrLKOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html#ab1b8b97d4f9b814eb64030c64b8292a4',1,'cv::SparsePyrLKOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/df/dc4/classcv_1_1optflow_1_1SparseRLOFOpticalFlow.html#aba5f11e32835a1bb9cf581294607e728',1,'cv::optflow::SparseRLOFOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1SphericalWarper.html#aff695ac7d04e494059ef97fecb918c37',1,'cv::SphericalWarper::create()'],['https://docs.opencv.org/4.2.0/dd/df9/classcv_1_1dnn_1_1SplitLayer.html#ab33cd669fb9a32233224be90edb552f6',1,'cv::dnn::SplitLayer::create()'],['https://docs.opencv.org/4.2.0/d6/d05/classcv_1_1datasets_1_1SR__bsds.html#a38c4798527052998a296b62feba2f848',1,'cv::datasets::SR_bsds::create()'],['https://docs.opencv.org/4.2.0/d2/db5/classcv_1_1datasets_1_1SR__div2k.html#ae4df44b1939b6c38cfd48a626977e300',1,'cv::datasets::SR_div2k::create()'],['https://docs.opencv.org/4.2.0/d5/d19/classcv_1_1datasets_1_1SR__general100.html#ac61d7a592c19e37f729ca45a4bcc4736',1,'cv::datasets::SR_general100::create()'],['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#a32c729774cf7fe39d44e82ef104a39cc',1,'cv::face::StandardCollector::create()'],['https://docs.opencv.org/4.2.0/dd/d39/classcv_1_1xfeatures2d_1_1StarDetector.html#a9f1ed97bd2b42e30fc0fb1355ad262d3',1,'cv::xfeatures2d::StarDetector::create()'],['https://docs.opencv.org/4.2.0/da/dd0/classcv_1_1saliency_1_1StaticSaliencyFineGrained.html#a2ed3862baf0b92e15c3717907add7be9',1,'cv::saliency::StaticSaliencyFineGrained::create()'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#ab4e9a99c23f99d49ff02f8764b48ebf0',1,'cv::saliency::StaticSaliencySpectralResidual::create()'],['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a1f0793fc10a980610acbd536d3afcf38',1,'cv::stereo::StereoBinaryBM::create()'],['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a756d8cdcc116945e6eea8b3a6103b92e',1,'cv::stereo::StereoBinarySGBM::create()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#a04fdf00525f82fe708d556e2cd359004',1,'cv::StereoBM::create()'],['https://docs.opencv.org/4.2.0/d2/d5e/classcv_1_1StereographicWarper.html#a1a772255d9246906fa1698a4b760b915',1,'cv::StereographicWarper::create()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#adb7a50ef5f200ad9559e9b0e976cfa59',1,'cv::StereoSGBM::create()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a308a47865a1f381e4429c8ec5e99549f',1,'cv::Stitcher::create()'],['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html#a436553ca44d9a2238761ddbee5b395e5',1,'cv::xfeatures2d::SURF::create()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a2fe8b5bf897c34b8e911397b42e2cb44',1,'cv::ml::SVM::create()'],['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a8dcb30f2aa335cf943fe52c2b8b7e954',1,'cv::ml::SVMSGD::create()'],['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1dnn_1_1SwishLayer.html#a7e7ff59243eadefe609e80a2d03ec92e',1,'cv::dnn::SwishLayer::create()'],['https://docs.opencv.org/4.2.0/df/d66/classcv_1_1dnn_1_1TanHLayer.html#a611dce31ac5365cae57edcad47ebdd66',1,'cv::dnn::TanHLayer::create()'],['https://docs.opencv.org/4.2.0/d1/d66/classcv_1_1text_1_1TextDetectorCNN.html#aeeca0f5caf9bec0f3f6ae2702057fa9a',1,'cv::text::TextDetectorCNN::create(const String &modelArchFilename, const String &modelWeightsFilename, std::vector< Size > detectionSizes)'],['https://docs.opencv.org/4.2.0/d1/d66/classcv_1_1text_1_1TextDetectorCNN.html#a24c574de8cd02e4eb14f402c08dc4c2f',1,'cv::text::TextDetectorCNN::create(const String &modelArchFilename, const String &modelWeightsFilename)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a44434d109746820cd8b3b14364dedd31',1,'cv::ogl::Texture2D::create(int arows, int acols, Format aformat, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#af9270d0d351251d3006a6e6a8dd01964',1,'cv::ogl::Texture2D::create(Size asize, Format aformat, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d7/dc3/classcv_1_1datasets_1_1TR__chars.html#a6bf21b5a6809d19d36a18a6ae74477a2',1,'cv::datasets::TR_chars::create()'],['https://docs.opencv.org/4.2.0/d7/dfb/classcv_1_1datasets_1_1TR__icdar.html#ab012a43900d6cc21be28f98d4ea9592a',1,'cv::datasets::TR_icdar::create()'],['https://docs.opencv.org/4.2.0/da/dc9/classcv_1_1datasets_1_1TR__svt.html#a210aad66282bff94c30fca6055dddf71',1,'cv::datasets::TR_svt::create()'],['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a2ad74f2af3c2065665dea125ece6ae53',1,'cv::datasets::TRACK_alov::create()'],['https://docs.opencv.org/4.2.0/dc/d52/classcv_1_1datasets_1_1TRACK__vot.html#a08040989ee22f78d12e748daecc58f7d',1,'cv::datasets::TRACK_vot::create()'],['https://docs.opencv.org/4.2.0/d1/d1a/classcv_1_1TrackerBoosting.html#aac2e7cae09f8aa7033723fb9f6910a8c',1,'cv::TrackerBoosting::create(const TrackerBoosting::Params &parameters)'],['https://docs.opencv.org/4.2.0/d1/d1a/classcv_1_1TrackerBoosting.html#ab23a9982c86f4a6b287c57e90d71cbaf',1,'cv::TrackerBoosting::create()'],['https://docs.opencv.org/4.2.0/d2/da2/classcv_1_1TrackerCSRT.html#a46b22b240d0dc3567bd8f0818f8e5bf9',1,'cv::TrackerCSRT::create(const TrackerCSRT::Params &parameters)'],['https://docs.opencv.org/4.2.0/d2/da2/classcv_1_1TrackerCSRT.html#a8165e42a785fcd88226ca80eea8dc8fb',1,'cv::TrackerCSRT::create()'],['https://docs.opencv.org/4.2.0/d7/da2/classcv_1_1TrackerFeature.html#aee351984f2ff5112a40cdaaa3b047079',1,'cv::TrackerFeature::create()'],['https://docs.opencv.org/4.2.0/d7/d4c/classcv_1_1TrackerGOTURN.html#a45f204a1fb7a92d72f7971a61a5ba656',1,'cv::TrackerGOTURN::create(const TrackerGOTURN::Params &parameters)'],['https://docs.opencv.org/4.2.0/d7/d4c/classcv_1_1TrackerGOTURN.html#aa2136acda39bc3e56c87857bb29b4ac3',1,'cv::TrackerGOTURN::create()'],['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#a8233d531a13a605e1b0d119a9058d8c7',1,'cv::TrackerKCF::create(const TrackerKCF::Params &parameters)'],['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#aa639858d75cfbfe59ae7afdd57070aef',1,'cv::TrackerKCF::create()'],['https://docs.opencv.org/4.2.0/d7/d86/classcv_1_1TrackerMedianFlow.html#a15b0a2920910ef6f0dda3a7e882fb2e8',1,'cv::TrackerMedianFlow::create(const TrackerMedianFlow::Params &parameters)'],['https://docs.opencv.org/4.2.0/d7/d86/classcv_1_1TrackerMedianFlow.html#a648b6755535c289aa606de4d8a581edf',1,'cv::TrackerMedianFlow::create()'],['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1TrackerMIL.html#a9699975916249a7edf69dc484c06a131',1,'cv::TrackerMIL::create(const TrackerMIL::Params &parameters)'],['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1TrackerMIL.html#aadd1a6748f4417131b53bf0832c290d3',1,'cv::TrackerMIL::create()'],['https://docs.opencv.org/4.2.0/d0/d02/classcv_1_1TrackerMOSSE.html#a31cb6f4535fee7acac5ddf014f96ac8d',1,'cv::TrackerMOSSE::create()'],['https://docs.opencv.org/4.2.0/dc/d75/classcv_1_1TrackerSamplerAlgorithm.html#a178e1fddbefbeb1232c131f4c1e715fe',1,'cv::TrackerSamplerAlgorithm::create()'],['https://docs.opencv.org/4.2.0/d2/db9/classcv_1_1TrackerStateEstimator.html#a4df632281f100fe1c4516ff196c08cfd',1,'cv::TrackerStateEstimator::create()'],['https://docs.opencv.org/4.2.0/dc/d1c/classcv_1_1TrackerTLD.html#a09727d29b7e2b3ad6ed533a7c32b304a',1,'cv::TrackerTLD::create(const TrackerTLD::Params &parameters)'],['https://docs.opencv.org/4.2.0/dc/d1c/classcv_1_1TrackerTLD.html#ae0ef488f924b8e44562ec14d87920d70',1,'cv::TrackerTLD::create()'],['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#a5e0c052f9aadce1f75cddbdbbf9c4f4d',1,'cv::ml::TrainData::create()'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#a863589f7fea7d1d5a9c9bfaae7480105',1,'cv::bioinspired::TransientAreasSegmentationModule::create()'],['https://docs.opencv.org/4.2.0/df/d33/classcv_1_1TransverseMercatorWarper.html#ab526ce2f23ea97145197487b266737a1',1,'cv::TransverseMercatorWarper::create()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#afe3063b40dd6c5d8a0054759c1142631',1,'cv::UMat::create(int rows, int cols, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ac0b2ce3cbd609f68092b8cffa2cc7155',1,'cv::UMat::create(Size size, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a0d6066cb804ad356c18fd7dc89203b92',1,'cv::UMat::create(int ndims, const int *sizes, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a1f51b337fe0ee25e7c659502e3fe1022',1,'cv::UMat::create(const std::vector< int > &sizes, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#a2b76ef34213b0f7279d64a5cfc5e0b11',1,'cv::VariationalRefinement::create()'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html#a34d18f82108b0fc399c8cd3bf2055237',1,'cv::xfeatures2d::VGG::create()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a24352ee160cb574af9c0a2ee4738b184',1,'cv::VideoWriter::create()'],['https://docs.opencv.org/4.2.0/d7/d1c/classcv_1_1WarperCreator.html#af89203acc50687d52d10257cbc8b3e09',1,'cv::WarperCreator::create()'],['https://docs.opencv.org/4.2.0/de/d0e/classcv_1_1xobjdetect_1_1WBDetector.html#a4d5db0d0bc5e276a4a53d8d34fabd14a',1,'cv::xobjdetect::WBDetector::create()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga67a1543e567dbfaa0b05630951caac2b',1,'create(cv::Size monoImgSize, cv::String paramFilepath=cv::String())(Global Namespace)']]], - ['create_20calibration_20pattern_1656',['Create calibration pattern',['https://docs.opencv.org/4.2.0/da/d0d/tutorial_camera_calibration_pattern.html',1,'']]], - ['create_5fhard_5flinks_1657',['create_hard_links',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a33508470ccdd33a1e663771efff2934b',1,'create_hard_links(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a33508470ccdd33a1e663771efff2934b',1,'create_hard_links(Global Namespace)']]], - ['create_5fread_5fwrite_5fdataset_2emarkdown_1658',['create_read_write_dataset.markdown',['https://docs.opencv.org/4.2.0/db/d27/create__read__write__dataset_8markdown.html',1,'']]], - ['create_5fsymlinks_1659',['create_symlinks',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a0e556d0167c1732aede37f4b39b59bce',1,'create_symlinks(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a0e556d0167c1732aede37f4b39b59bce',1,'create_symlinks(Global Namespace)']]], - ['createaffinetransformer_1660',['createAffineTransformer',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gaf2fba7d213cfd8a9e163171dcbbb12e3',1,'cv::createAffineTransformer()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gaf2fba7d213cfd8a9e163171dcbbb12e3',1,'createAffineTransformer()(Global Namespace)']]], - ['createalignmtb_1661',['createAlignMTB',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga2f1fafc885a5d79dbfb3542e08db0244',1,'cv::createAlignMTB()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga2f1fafc885a5d79dbfb3542e08db0244',1,'createAlignMTB()(Global Namespace)']]], - ['createamfilter_1662',['createAMFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gabb57336e67f7ea15d420e43f03823a11',1,'cv::ximgproc::createAMFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gabb57336e67f7ea15d420e43f03823a11',1,'createAMFilter()(Global Namespace)']]], - ['createaugmentedunscentedkalmanfilter_1663',['createAugmentedUnscentedKalmanFilter',['https://docs.opencv.org/4.2.0/da/dd0/namespacecv_1_1tracking.html#ad9ab42a3157dfbd2ac98fc42ad8fae4e',1,'cv::tracking']]], - ['createbackgroundsubtractorcnt_1664',['createBackgroundSubtractorCNT',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gab344bf148349e4cbeb3ed39efa9fbd2c',1,'cv::bgsegm::createBackgroundSubtractorCNT()'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gab344bf148349e4cbeb3ed39efa9fbd2c',1,'createBackgroundSubtractorCNT()(Global Namespace)']]], - ['createbackgroundsubtractorfgd_1665',['createBackgroundSubtractorFGD',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga56bc19f42734742cebf4f9b0837bc427',1,'cv::cuda::createBackgroundSubtractorFGD()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga56bc19f42734742cebf4f9b0837bc427',1,'createBackgroundSubtractorFGD()(Global Namespace)']]], - ['createbackgroundsubtractorgmg_1666',['createBackgroundSubtractorGMG',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gae561c9701970d0e6b35ec12bae149814',1,'cv::bgsegm::createBackgroundSubtractorGMG()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga87e2dcae3781a00327b42ed3920e502f',1,'cv::cuda::createBackgroundSubtractorGMG()'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gae561c9701970d0e6b35ec12bae149814',1,'createBackgroundSubtractorGMG(int initializationFrames=120, double decisionThreshold=0.8)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga87e2dcae3781a00327b42ed3920e502f',1,'createBackgroundSubtractorGMG(int initializationFrames=120, double decisionThreshold=0.8)(Global Namespace)']]], - ['createbackgroundsubtractorgsoc_1667',['createBackgroundSubtractorGSOC',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga7ba3e826c343adc15782ab9139f82445',1,'cv::bgsegm::createBackgroundSubtractorGSOC()'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga7ba3e826c343adc15782ab9139f82445',1,'createBackgroundSubtractorGSOC()(Global Namespace)']]], - ['createbackgroundsubtractorknn_1668',['createBackgroundSubtractorKNN',['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html#gac9be925771f805b6fdb614ec2292006d',1,'cv::createBackgroundSubtractorKNN()'],['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html#gac9be925771f805b6fdb614ec2292006d',1,'createBackgroundSubtractorKNN()(Global Namespace)']]], - ['createbackgroundsubtractorlsbp_1669',['createBackgroundSubtractorLSBP',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gaec3834f6a43f5bfda4d6bdd23c44d394',1,'cv::bgsegm::createBackgroundSubtractorLSBP()'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gaec3834f6a43f5bfda4d6bdd23c44d394',1,'createBackgroundSubtractorLSBP()(Global Namespace)']]], - ['createbackgroundsubtractormog_1670',['createBackgroundSubtractorMOG',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga17d9525d2ad71f74d8d29c2c5e11903d',1,'cv::bgsegm::createBackgroundSubtractorMOG()'],['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html#ga6742648a654585013544eaa300f77b57',1,'cv::cuda::createBackgroundSubtractorMOG()'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga17d9525d2ad71f74d8d29c2c5e11903d',1,'createBackgroundSubtractorMOG(int history=200, int nmixtures=5, double backgroundRatio=0.7, double noiseSigma=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html#ga6742648a654585013544eaa300f77b57',1,'createBackgroundSubtractorMOG(int history=200, int nmixtures=5, double backgroundRatio=0.7, double noiseSigma=0)(Global Namespace)']]], - ['createbackgroundsubtractormog2_1671',['createBackgroundSubtractorMOG2',['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html#ga2beb2dee7a073809ccec60f145b6b29c',1,'cv::createBackgroundSubtractorMOG2()'],['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html#ga545102f6ffaa5cac18eb75d338598427',1,'cv::cuda::createBackgroundSubtractorMOG2()'],['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html#ga2beb2dee7a073809ccec60f145b6b29c',1,'createBackgroundSubtractorMOG2(int history=500, double varThreshold=16, bool detectShadows=true)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html#ga545102f6ffaa5cac18eb75d338598427',1,'createBackgroundSubtractorMOG2(int history=500, double varThreshold=16, bool detectShadows=true)(Global Namespace)']]], - ['createbfmatcher_1672',['createBFMatcher',['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#ac821657d8859f70c0592b91d7d48673c',1,'cv::cuda::DescriptorMatcher']]], - ['createbinarydescriptor_1673',['createBinaryDescriptor',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#ad896d4dfe36452cf01bd578f78d3062a',1,'cv::line_descriptor::BinaryDescriptor::createBinaryDescriptor()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#af5ff01839d73277260983900c9460a75',1,'cv::line_descriptor::BinaryDescriptor::createBinaryDescriptor(Params parameters)']]], - ['createbinarydescriptormatcher_1674',['createBinaryDescriptorMatcher',['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html#afd10bfe7d4ab8c952599745b088e9af2',1,'cv::line_descriptor::BinaryDescriptorMatcher']]], - ['createboxfilter_1675',['createBoxFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga3113b66e289bad7caef412e6e13ec2be',1,'cv::cuda::createBoxFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga3113b66e289bad7caef412e6e13ec2be',1,'createBoxFilter()(Global Namespace)']]], - ['createboxmaxfilter_1676',['createBoxMaxFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaaf4740c51128d23a37f6f1b22cee49e8',1,'cv::cuda::createBoxMaxFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaaf4740c51128d23a37f6f1b22cee49e8',1,'createBoxMaxFilter()(Global Namespace)']]], - ['createboxminfilter_1677',['createBoxMinFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga77fd36949bc8d92aabc120b4b1cfaafa',1,'cv::cuda::createBoxMinFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga77fd36949bc8d92aabc120b4b1cfaafa',1,'createBoxMinFilter()(Global Namespace)']]], - ['createbutton_1678',['createButton',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga938dc3ab0a9f115156439bd380816e2c',1,'cv::createButton()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga938dc3ab0a9f115156439bd380816e2c',1,'createButton()(Global Namespace)']]], - ['createcalibratedebevec_1679',['createCalibrateDebevec',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga7fed9707ad5f2cc0e633888867109f90',1,'cv::createCalibrateDebevec()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga7fed9707ad5f2cc0e633888867109f90',1,'createCalibrateDebevec()(Global Namespace)']]], - ['createcalibraterobertson_1680',['createCalibrateRobertson',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gae77813a21cd351a596619e5ff013be5d',1,'cv::createCalibrateRobertson()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gae77813a21cd351a596619e5ff013be5d',1,'createCalibrateRobertson()(Global Namespace)']]], - ['createcameraentity_1681',['createCameraEntity',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a015c89a8a6510ccc09e3395e651f62ac',1,'cv::ovis::WindowScene']]], - ['createcannyedgedetector_1682',['createCannyEdgeDetector',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gabc17953de36faa404acb07dc587451fc',1,'cv::cuda::createCannyEdgeDetector()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gabc17953de36faa404acb07dc587451fc',1,'createCannyEdgeDetector()(Global Namespace)']]], - ['createchihistogramcostextractor_1683',['createChiHistogramCostExtractor',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga914d5384804cb0fcc5eccc62a50b79ed',1,'cv::createChiHistogramCostExtractor()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga914d5384804cb0fcc5eccc62a50b79ed',1,'createChiHistogramCostExtractor()(Global Namespace)']]], - ['createclahe_1684',['createCLAHE',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gad689d2607b7b3889453804f414ab1018',1,'cv::createCLAHE()'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga950d3228b77b368a452553dcf57308c0',1,'cv::cuda::createCLAHE()'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gad689d2607b7b3889453804f414ab1018',1,'createCLAHE(double clipLimit=40.0, Size tileGridSize=Size(8, 8))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga950d3228b77b368a452553dcf57308c0',1,'createCLAHE(double clipLimit=40.0, Size tileGridSize=Size(8, 8))(Global Namespace)']]], - ['createcolumnsumfilter_1685',['createColumnSumFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gac13bf7c41a34bfde2a7f33ad8caacfdf',1,'cv::cuda::createColumnSumFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gac13bf7c41a34bfde2a7f33ad8caacfdf',1,'createColumnSumFilter()(Global Namespace)']]], - ['createconcentricspherestestset_1686',['createConcentricSpheresTestSet',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ga28249d75f6dc48d8eae29731395f2027',1,'cv::ml::createConcentricSpheresTestSet()'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ga28249d75f6dc48d8eae29731395f2027',1,'createConcentricSpheresTestSet()(Global Namespace)']]], - ['createcontinuous_1687',['createContinuous',['../classfilters_1_1KalmanFilter.html#ad3a6b07e72a76f916d04818f2be2810f',1,'filters::KalmanFilter::createContinuous()'],['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga3a55474eb59c884697edf397fe0f871c',1,'cv::cuda::createContinuous()'],['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga3a55474eb59c884697edf397fe0f871c',1,'createContinuous()(Global Namespace)']]], - ['createcontourfitting_1688',['createContourFitting',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#gadddbddafbb6eb9795246371772924c7c',1,'cv::ximgproc::createContourFitting()'],['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#gadddbddafbb6eb9795246371772924c7c',1,'createContourFitting()(Global Namespace)']]], - ['createconvolution_1689',['createConvolution',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga2695e05ef624bf3ce03cfbda383a821d',1,'cv::cuda::createConvolution()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga2695e05ef624bf3ce03cfbda383a821d',1,'createConvolution()(Global Namespace)']]], - ['createcovariancematrix_1690',['createCovarianceMatrix',['../namespacefilters_1_1statespace.html#a24d701aa77b14b0dee3e4a782bccb4b3',1,'filters::statespace']]], - ['createdatainstance_1691',['createDataInstance',['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#a214a5c797bf1aa889e81430dcfea596b',1,'cv::TLSData::createDataInstance()'],['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#a214a5c797bf1aa889e81430dcfea596b',1,'TLSData< cv::instr::NodeDataTls >::createDataInstance()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a08015abe3d6199e847e5bc23e2080f12',1,'cv::TLSDataAccumulator::createDataInstance()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a08015abe3d6199e847e5bc23e2080f12',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::createDataInstance()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#a13487b759ad6e80b5ac95171f5973027',1,'cv::TLSDataContainer::createDataInstance()']]], - ['createdefault_1692',['createDefault',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#ae5102a5ed5866711ba0e8347576307eb',1,'cv::detail::Blender::createDefault()'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#a72d0796c30091cdc686ad63ea46ebdc4',1,'cv::detail::ExposureCompensator::createDefault()'],['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html#acc8f6a3a6f6fe62ca55cdad655aab4b9',1,'cv::detail::SeamFinder::createDefault()'],['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#a2176b3377039b2851545e6d9de6f7b95',1,'cv::detail::Timelapser::createDefault()']]], - ['createderivfilter_1693',['createDerivFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga14d76dc6982ce739c67198f52bc16ee1',1,'cv::cuda::createDerivFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga14d76dc6982ce739c67198f52bc16ee1',1,'createDerivFilter()(Global Namespace)']]], - ['createdft_1694',['createDFT',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga0f72d063b73c8bb995678525eb076f10',1,'cv::cuda::createDFT()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga0f72d063b73c8bb995678525eb076f10',1,'createDFT()(Global Namespace)']]], - ['createdirectories_1695',['createDirectories',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#adc14f8d4f218ffd770ce57d4380d859f',1,'cv::utils::fs']]], - ['createdirectory_1696',['createDirectory',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html#ga67fef8eb0a66502901e995d9b3b2fb20',1,'cv::datasets::createDirectory()'],['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#aca64d8ee9509dc1db0acef5dbc807e6d',1,'cv::utils::fs::createDirectory()'],['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html#ga67fef8eb0a66502901e995d9b3b2fb20',1,'createDirectory()(Global Namespace)']]], - ['creatediscrete_1697',['createDiscrete',['../classfilters_1_1KalmanFilter.html#a67ad53d7267815441006a7f5c3a9fa63',1,'filters::KalmanFilter']]], - ['createdisparitybilateralfilter_1698',['createDisparityBilateralFilter',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#gaafb5f9902f7a9e74cb2cd4e680569590',1,'cv::cuda::createDisparityBilateralFilter()'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#gaafb5f9902f7a9e74cb2cd4e680569590',1,'createDisparityBilateralFilter()(Global Namespace)']]], - ['createdisparitywlsfilter_1699',['createDisparityWLSFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga8a351f67b897bb7cdaccaef115bafcac',1,'cv::ximgproc::createDisparityWLSFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga8a351f67b897bb7cdaccaef115bafcac',1,'createDisparityWLSFilter()(Global Namespace)']]], - ['createdisparitywlsfiltergeneric_1700',['createDisparityWLSFilterGeneric',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gad79c31494e3bb92d4b30e0dcefae1249',1,'cv::ximgproc::createDisparityWLSFilterGeneric()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gad79c31494e3bb92d4b30e0dcefae1249',1,'createDisparityWLSFilterGeneric()(Global Namespace)']]], - ['createdtfilter_1701',['createDTFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga9580eab93469544068f44882b5d24608',1,'cv::ximgproc::createDTFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga9580eab93469544068f44882b5d24608',1,'createDTFilter()(Global Namespace)']]], - ['createedgeawareinterpolator_1702',['createEdgeAwareInterpolator',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaadaeb21a59234d8f22d4465a641fe7be',1,'cv::ximgproc::createEdgeAwareInterpolator()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaadaeb21a59234d8f22d4465a641fe7be',1,'createEdgeAwareInterpolator()(Global Namespace)']]], - ['createedgeboxes_1703',['createEdgeBoxes',['https://docs.opencv.org/4.2.0/d4/d0d/group__ximgproc__edgeboxes.html#ga226d8e1a2dee5dfb58708b97f490b18a',1,'cv::ximgproc::createEdgeBoxes()'],['https://docs.opencv.org/4.2.0/d4/d0d/group__ximgproc__edgeboxes.html#ga226d8e1a2dee5dfb58708b97f490b18a',1,'createEdgeBoxes()(Global Namespace)']]], - ['createemdhistogramcostextractor_1704',['createEMDHistogramCostExtractor',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gafd12c095a67435368d86805f579b21c5',1,'cv::createEMDHistogramCostExtractor()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gafd12c095a67435368d86805f579b21c5',1,'createEMDHistogramCostExtractor()(Global Namespace)']]], - ['createemdl1histogramcostextractor_1705',['createEMDL1HistogramCostExtractor',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gab11979a83dfff08e4507b5e790594ee1',1,'cv::createEMDL1HistogramCostExtractor()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gab11979a83dfff08e4507b5e790594ee1',1,'createEMDL1HistogramCostExtractor()(Global Namespace)']]], - ['createentity_1706',['createEntity',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a08fdc90b961da70aaf58cad08a9e97d8',1,'cv::ovis::WindowScene']]], - ['createerfilternm1_1707',['createERFilterNM1',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga34e6b32cc3db805155ab51dcd7bc61d5',1,'cv::text::createERFilterNM1(const Ptr< ERFilter::Callback > &cb, int thresholdDelta=1, float minArea=(float) 0.00025, float maxArea=(float) 0.13, float minProbability=(float) 0.4, bool nonMaxSuppression=true, float minProbabilityDiff=(float) 0.1)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gad0dbf50d68acbacfbe466c4bc31cdcd2',1,'cv::text::createERFilterNM1(const String &filename, int thresholdDelta=1, float minArea=(float) 0.00025, float maxArea=(float) 0.13, float minProbability=(float) 0.4, bool nonMaxSuppression=true, float minProbabilityDiff=(float) 0.1)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga34e6b32cc3db805155ab51dcd7bc61d5',1,'createERFilterNM1(const Ptr< ERFilter::Callback > &cb, int thresholdDelta=1, float minArea=(float) 0.00025, float maxArea=(float) 0.13, float minProbability=(float) 0.4, bool nonMaxSuppression=true, float minProbabilityDiff=(float) 0.1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gad0dbf50d68acbacfbe466c4bc31cdcd2',1,'createERFilterNM1(const String &filename, int thresholdDelta=1, float minArea=(float) 0.00025, float maxArea=(float) 0.13, float minProbability=(float) 0.4, bool nonMaxSuppression=true, float minProbabilityDiff=(float) 0.1)(Global Namespace)']]], - ['createerfilternm2_1708',['createERFilterNM2',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga00f010f5b65cc60d1290a76807d39c95',1,'cv::text::createERFilterNM2(const Ptr< ERFilter::Callback > &cb, float minProbability=(float) 0.3)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga56f17c714f8403ef00b02022eeebb8a2',1,'cv::text::createERFilterNM2(const String &filename, float minProbability=(float) 0.3)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga00f010f5b65cc60d1290a76807d39c95',1,'createERFilterNM2(const Ptr< ERFilter::Callback > &cb, float minProbability=(float) 0.3)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga56f17c714f8403ef00b02022eeebb8a2',1,'createERFilterNM2(const String &filename, float minProbability=(float) 0.3)(Global Namespace)']]], - ['createfacedetectionmaskgenerator_1709',['createFaceDetectionMaskGenerator',['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ga9767823749e5e5df561593c2c85939cc',1,'cv::createFaceDetectionMaskGenerator()'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ga9767823749e5e5df561593c2c85939cc',1,'createFaceDetectionMaskGenerator()(Global Namespace)']]], - ['createfacemarkaam_1710',['createFacemarkAAM',['https://docs.opencv.org/4.2.0/d4/d48/namespacecv_1_1face.html#aedc268b74cfa8bbad74652e577345220',1,'cv::face']]], - ['createfacemarkkazemi_1711',['createFacemarkKazemi',['https://docs.opencv.org/4.2.0/d4/d48/namespacecv_1_1face.html#a2c5697c7d2bc0e76fc86e69b2378d9c9',1,'cv::face']]], - ['createfacemarklbf_1712',['createFacemarkLBF',['https://docs.opencv.org/4.2.0/d4/d48/namespacecv_1_1face.html#a0bec73a729ed878430c2feb9ce65bc2a',1,'cv::face']]], - ['createfastbilateralsolverfilter_1713',['createFastBilateralSolverFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga29d8ebf3499b69428db1d15d95513ca9',1,'cv::ximgproc::createFastBilateralSolverFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga29d8ebf3499b69428db1d15d95513ca9',1,'createFastBilateralSolverFilter()(Global Namespace)']]], - ['createfastglobalsmootherfilter_1714',['createFastGlobalSmootherFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga917687dcab45e44e1382134650c1f3d3',1,'cv::ximgproc::createFastGlobalSmootherFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga917687dcab45e44e1382134650c1f3d3',1,'createFastGlobalSmootherFilter()(Global Namespace)']]], - ['createfastlinedetector_1715',['createFastLineDetector',['https://docs.opencv.org/4.2.0/df/ded/group__ximgproc__fast__line__detector.html#gaa9636e5033cd2939ec50810f2b2bd853',1,'cv::ximgproc::createFastLineDetector()'],['https://docs.opencv.org/4.2.0/df/ded/group__ximgproc__fast__line__detector.html#gaa9636e5033cd2939ec50810f2b2bd853',1,'createFastLineDetector()(Global Namespace)']]], - ['createflags_1716',['CreateFlags',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa912544338415c5f8c8e55e85a139bfb',1,'cv::cuda::Event']]], - ['createframesource_5fcamera_1717',['createFrameSource_Camera',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga84e5f25bf81d7c9c2d03d90d84e7a3b4',1,'cv::superres::createFrameSource_Camera()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga84e5f25bf81d7c9c2d03d90d84e7a3b4',1,'createFrameSource_Camera()(Global Namespace)']]], - ['createframesource_5fempty_1718',['createFrameSource_Empty',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga5e43d87eeb716178a8e536b586ce7014',1,'cv::superres::createFrameSource_Empty()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga5e43d87eeb716178a8e536b586ce7014',1,'createFrameSource_Empty()(Global Namespace)']]], - ['createframesource_5fvideo_1719',['createFrameSource_Video',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gac6a56603cc8a807aed13eff65126954a',1,'cv::superres::createFrameSource_Video()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gac6a56603cc8a807aed13eff65126954a',1,'createFrameSource_Video()(Global Namespace)']]], - ['createframesource_5fvideo_5fcuda_1720',['createFrameSource_Video_CUDA',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga57219779f065060427f61038cc27fdd8',1,'cv::superres::createFrameSource_Video_CUDA()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga57219779f065060427f61038cc27fdd8',1,'createFrameSource_Video_CUDA()(Global Namespace)']]], - ['createfreetype2_1721',['createFreeType2',['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html#ga0fd8f9c0ae69bb4d95c41af79473a756',1,'cv::freetype::createFreeType2()'],['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html#ga0fd8f9c0ae69bb4d95c41af79473a756',1,'createFreeType2()(Global Namespace)']]], - ['creategaussianfilter_1722',['createGaussianFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaa4df286369114cfd4b144ae211f6a6c8',1,'cv::cuda::createGaussianFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaa4df286369114cfd4b144ae211f6a6c8',1,'createGaussianFilter()(Global Namespace)']]], - ['creategeneralizedhoughballard_1723',['createGeneralizedHoughBallard',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga3252811b8a7a5f606dc0a88927982ee9',1,'cv::createGeneralizedHoughBallard()'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#gab1ad5dc018f9b42d291aa4781d6ee620',1,'cv::cuda::createGeneralizedHoughBallard()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga3252811b8a7a5f606dc0a88927982ee9',1,'createGeneralizedHoughBallard()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#gab1ad5dc018f9b42d291aa4781d6ee620',1,'createGeneralizedHoughBallard()(Global Namespace)']]], - ['creategeneralizedhoughguil_1724',['createGeneralizedHoughGuil',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gae2eb1e12452257b63d09ba9ce871f58c',1,'cv::createGeneralizedHoughGuil()'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga4b0e2bd03af39ae97ab4f358aa5378ab',1,'cv::cuda::createGeneralizedHoughGuil()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gae2eb1e12452257b63d09ba9ce871f58c',1,'createGeneralizedHoughGuil()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga4b0e2bd03af39ae97ab4f358aa5378ab',1,'createGeneralizedHoughGuil()(Global Namespace)']]], - ['creategoodfeaturestotrackdetector_1725',['createGoodFeaturesToTrackDetector',['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html#ga478b474a598ece101f7e706fee2c8e91',1,'cv::cuda::createGoodFeaturesToTrackDetector()'],['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html#ga478b474a598ece101f7e706fee2c8e91',1,'createGoodFeaturesToTrackDetector()(Global Namespace)']]], - ['creategpumatheader_1726',['createGpuMatHeader',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a6444e4aa55f0c4cd6fcba072763106ff',1,'cv::cuda::HostMem']]], - ['creategraphsegmentation_1727',['createGraphSegmentation',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga5e3e721c5f16e34d3ad52b9eeb6d2860',1,'cv::ximgproc::segmentation::createGraphSegmentation()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga5e3e721c5f16e34d3ad52b9eeb6d2860',1,'createGraphSegmentation()(Global Namespace)']]], - ['creategrayworldwb_1728',['createGrayworldWB',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga6ecef774888036ddff15995512bdee39',1,'cv::xphoto::createGrayworldWB()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga6ecef774888036ddff15995512bdee39',1,'createGrayworldWB()(Global Namespace)']]], - ['creategridmesh_1729',['createGridMesh',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gaf483ecf2b3b15220f7a7aa1597b4eb54',1,'cv::ovis::createGridMesh()'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gaf483ecf2b3b15220f7a7aa1597b4eb54',1,'createGridMesh()(Global Namespace)']]], - ['createguidedfilter_1730',['createGuidedFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaf9f74771a6c947699be44592e8f0b61c',1,'cv::ximgproc::createGuidedFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaf9f74771a6c947699be44592e8f0b61c',1,'createGuidedFilter()(Global Namespace)']]], - ['createhanningwindow_1731',['createHanningWindow',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html#ga80e5c3de52f6bab3a7c1e60e89308e1b',1,'cv::createHanningWindow()'],['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html#ga80e5c3de52f6bab3a7c1e60e89308e1b',1,'createHanningWindow()(Global Namespace)']]], - ['createharriscorner_1732',['createHarrisCorner',['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html#ga3e5878a803e9bba51added0c10101979',1,'cv::cuda::createHarrisCorner()'],['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html#ga3e5878a803e9bba51added0c10101979',1,'createHarrisCorner()(Global Namespace)']]], - ['createhausdorffdistanceextractor_1733',['createHausdorffDistanceExtractor',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga1d058c5d00f6292da61422af2f3f4adc',1,'cv::createHausdorffDistanceExtractor()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga1d058c5d00f6292da61422af2f3f4adc',1,'createHausdorffDistanceExtractor()(Global Namespace)']]], - ['createheader_1734',['createHeader',['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html#a1d8f0bcae680f2386522bb3afc6dd262',1,'cv::cnn_3dobj::icoSphere']]], - ['createhoughcirclesdetector_1735',['createHoughCirclesDetector',['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga8e7921f114a5a4a3c85e86484c8f9597',1,'cv::cuda::createHoughCirclesDetector()'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga8e7921f114a5a4a3c85e86484c8f9597',1,'createHoughCirclesDetector()(Global Namespace)']]], - ['createhoughlinesdetector_1736',['createHoughLinesDetector',['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga1ac6e82a77233239dc20e14d1c21ddf9',1,'cv::cuda::createHoughLinesDetector()'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga1ac6e82a77233239dc20e14d1c21ddf9',1,'createHoughLinesDetector()(Global Namespace)']]], - ['createhoughsegmentdetector_1737',['createHoughSegmentDetector',['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga5a5959a24e8cb4da131bcffbf56b13cd',1,'cv::cuda::createHoughSegmentDetector()'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga5a5959a24e8cb4da131bcffbf56b13cd',1,'createHoughSegmentDetector()(Global Namespace)']]], - ['createimagepyramid_1738',['createImagePyramid',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gaeaa78f1925d1eb8605564ca159c7ae52',1,'cv::cuda::createImagePyramid()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gaeaa78f1925d1eb8605564ca159c7ae52',1,'createImagePyramid()(Global Namespace)']]], - ['createkernel_1739',['createKernel',['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga0e5694cf8dd380d512e915660870027c',1,'cv::ft::createKernel(InputArray A, InputArray B, OutputArray kernel, const int chn)'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga8b7e380f7e09f0efa30ca315f50bd214',1,'cv::ft::createKernel(int function, int radius, OutputArray kernel, const int chn)'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga0e5694cf8dd380d512e915660870027c',1,'createKernel(InputArray A, InputArray B, OutputArray kernel, const int chn)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga8b7e380f7e09f0efa30ca315f50bd214',1,'createKernel(int function, int radius, OutputArray kernel, const int chn)(Global Namespace)']]], - ['createlaplacepyr_1740',['createLaplacePyr',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#gac41bfd71102d3739962d6f034464e9ce',1,'cv::detail::createLaplacePyr()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#gac41bfd71102d3739962d6f034464e9ce',1,'createLaplacePyr()(Global Namespace)']]], - ['createlaplacepyrgpu_1741',['createLaplacePyrGpu',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga3cce24901db3d32e5bb0d3e31b67f622',1,'cv::detail::createLaplacePyrGpu()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga3cce24901db3d32e5bb0d3e31b67f622',1,'createLaplacePyrGpu()(Global Namespace)']]], - ['createlaplacianfilter_1742',['createLaplacianFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga53126e88bb7e6185dcd5628e28e42cd2',1,'cv::cuda::createLaplacianFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga53126e88bb7e6185dcd5628e28e42cd2',1,'createLaplacianFilter()(Global Namespace)']]], - ['createlayerinstance_1743',['createLayerInstance',['https://docs.opencv.org/4.2.0/d4/d67/classcv_1_1dnn_1_1LayerFactory.html#a850765f77a59a3c2f58eeb0e5a930ac3',1,'cv::dnn::LayerFactory']]], - ['createlearningbasedwb_1744',['createLearningBasedWB',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac8fb5636b27eac575f4a4c9c54dd1c7c',1,'cv::xphoto::createLearningBasedWB()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac8fb5636b27eac575f4a4c9c54dd1c7c',1,'createLearningBasedWB()(Global Namespace)']]], - ['createlightentity_1745',['createLightEntity',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#af82c1f760715911452b867263e74291d',1,'cv::ovis::WindowScene']]], - ['createlinearfilter_1746',['createLinearFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga57cb1804ad9d1280bf86433858daabf9',1,'cv::cuda::createLinearFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga57cb1804ad9d1280bf86433858daabf9',1,'createLinearFilter()(Global Namespace)']]], - ['createlinesegmentdetector_1747',['createLineSegmentDetector',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga6b2ad2353c337c42551b521a73eeae7d',1,'cv::createLineSegmentDetector()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga6b2ad2353c337c42551b521a73eeae7d',1,'createLineSegmentDetector()(Global Namespace)']]], - ['createlookuptable_1748',['createLookUpTable',['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga2d9d9780dea8c5cd85d3c19b7e01979c',1,'cv::cuda::createLookUpTable()'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga2d9d9780dea8c5cd85d3c19b7e01979c',1,'createLookUpTable()(Global Namespace)']]], - ['createlsddetector_1749',['createLSDDetector',['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#a8de4c87977c2d3fa54b765df532cbf96',1,'cv::line_descriptor::LSDDetector::createLSDDetector()'],['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#a0b1881863371c04f4236255cf3b7c32d',1,'cv::line_descriptor::LSDDetector::createLSDDetector(LSDParam params)']]], - ['creatematheader_1750',['createMatHeader',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a017b175a89135b3dd04c5825913e6b87',1,'cv::cuda::HostMem']]], - ['createmedianfilter_1751',['createMedianFilter',['https://docs.opencv.org/4.2.0/d1/d1a/namespacecv_1_1cuda.html#a154a3042e03f9f220db223216da8c9d0',1,'cv::cuda']]], - ['createmergedebevec_1752',['createMergeDebevec',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gaa8eab36bc764abb2a225db7c945f87f9',1,'cv::createMergeDebevec()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gaa8eab36bc764abb2a225db7c945f87f9',1,'createMergeDebevec()(Global Namespace)']]], - ['createmergemertens_1753',['createMergeMertens',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga79d59aa3cb3a7c664e59a4b5acc1ccb6',1,'cv::createMergeMertens()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga79d59aa3cb3a7c664e59a4b5acc1ccb6',1,'createMergeMertens()(Global Namespace)']]], - ['createmergerobertson_1754',['createMergeRobertson',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga460d4a1df1a7e8cdcf7445bb87a8fb78',1,'cv::createMergeRobertson()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga460d4a1df1a7e8cdcf7445bb87a8fb78',1,'createMergeRobertson()(Global Namespace)']]], - ['createmineigenvalcorner_1755',['createMinEigenValCorner',['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html#ga7457fd4b53b025f990b1c1dd1b749915',1,'cv::cuda::createMinEigenValCorner()'],['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html#ga7457fd4b53b025f990b1c1dd1b749915',1,'createMinEigenValCorner()(Global Namespace)']]], - ['createmorphologyfilter_1756',['createMorphologyFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gae58694e07be6bdbae126f36c75c08ee6',1,'cv::cuda::createMorphologyFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gae58694e07be6bdbae126f36c75c08ee6',1,'createMorphologyFilter()(Global Namespace)']]], - ['createnormhistogramcostextractor_1757',['createNormHistogramCostExtractor',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga1481005d6d11c15a6953c6a85d5f310d',1,'cv::createNormHistogramCostExtractor()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga1481005d6d11c15a6953c6a85d5f310d',1,'createNormHistogramCostExtractor()(Global Namespace)']]], - ['createocrhmmtransitionstable_1758',['createOCRHMMTransitionsTable',['https://docs.opencv.org/4.2.0/d8/de7/namespacecv_1_1text.html#a4ed3cbd46c1559f046cd25288a1f024b',1,'cv::text::createOCRHMMTransitionsTable(std::string &vocabulary, std::vector< std::string > &lexicon, OutputArray transition_probabilities_table)'],['https://docs.opencv.org/4.2.0/d8/de7/namespacecv_1_1text.html#adfc8fe61325b04caf837633f36f74c77',1,'cv::text::createOCRHMMTransitionsTable(const String &vocabulary, std::vector< cv::String > &lexicon)']]], - ['createoneelemsets_1759',['createOneElemSets',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#a840589dd0b4786c04f7505d238b60531',1,'cv::detail::DisjointSets']]], - ['createoptflow_5fbrox_5fcuda_1760',['createOptFlow_Brox_CUDA',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga9aa098f573b34c2640dde7141cb7341e',1,'cv::superres::createOptFlow_Brox_CUDA()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga9aa098f573b34c2640dde7141cb7341e',1,'createOptFlow_Brox_CUDA()(Global Namespace)']]], - ['createoptflow_5fdeepflow_1761',['createOptFlow_DeepFlow',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga5e735547610172695cb0b39495af9d6d',1,'cv::optflow::createOptFlow_DeepFlow()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga5e735547610172695cb0b39495af9d6d',1,'createOptFlow_DeepFlow()(Global Namespace)']]], - ['createoptflow_5fdenserlof_1762',['createOptFlow_DenseRLOF',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga6c01ebcd843767fd4bd754f4238dc72c',1,'cv::optflow::createOptFlow_DenseRLOF()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga6c01ebcd843767fd4bd754f4238dc72c',1,'createOptFlow_DenseRLOF()(Global Namespace)']]], - ['createoptflow_5fdualtvl1_1763',['createOptFlow_DualTVL1',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga132098d4d6e74b96c715bb9c451a1d8f',1,'cv::optflow::createOptFlow_DualTVL1()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gadf0096066f129679ccec36355a013b1f',1,'cv::superres::createOptFlow_DualTVL1()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga132098d4d6e74b96c715bb9c451a1d8f',1,'createOptFlow_DualTVL1()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gadf0096066f129679ccec36355a013b1f',1,'createOptFlow_DualTVL1()(Global Namespace)']]], - ['createoptflow_5fdualtvl1_5fcuda_1764',['createOptFlow_DualTVL1_CUDA',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga1ff741c2af0d33d51cf789a926e71481',1,'cv::superres::createOptFlow_DualTVL1_CUDA()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga1ff741c2af0d33d51cf789a926e71481',1,'createOptFlow_DualTVL1_CUDA()(Global Namespace)']]], - ['createoptflow_5ffarneback_1765',['createOptFlow_Farneback',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gadd1519b8b360c101de0a2d3d3ca5f0e1',1,'cv::optflow::createOptFlow_Farneback()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga7cda87ef90a39c812915300cb3bb615a',1,'cv::superres::createOptFlow_Farneback()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gadd1519b8b360c101de0a2d3d3ca5f0e1',1,'createOptFlow_Farneback()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga7cda87ef90a39c812915300cb3bb615a',1,'createOptFlow_Farneback()(Global Namespace)']]], - ['createoptflow_5ffarneback_5fcuda_1766',['createOptFlow_Farneback_CUDA',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga2a9ff64ab93b3c6df988ce33ed1a9e48',1,'cv::superres::createOptFlow_Farneback_CUDA()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga2a9ff64ab93b3c6df988ce33ed1a9e48',1,'createOptFlow_Farneback_CUDA()(Global Namespace)']]], - ['createoptflow_5fpcaflow_1767',['createOptFlow_PCAFlow',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gabbf0942f6ab840dcb1c10273b02507f0',1,'cv::optflow::createOptFlow_PCAFlow()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gabbf0942f6ab840dcb1c10273b02507f0',1,'createOptFlow_PCAFlow()(Global Namespace)']]], - ['createoptflow_5fpyrlk_5fcuda_1768',['createOptFlow_PyrLK_CUDA',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gaf88e3b7fbb6c32cec4c802dcb079400c',1,'cv::superres::createOptFlow_PyrLK_CUDA()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gaf88e3b7fbb6c32cec4c802dcb079400c',1,'createOptFlow_PyrLK_CUDA()(Global Namespace)']]], - ['createoptflow_5fsimpleflow_1769',['createOptFlow_SimpleFlow',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gab3fd0cd6d32cb7cfa169cb72e804d0b4',1,'cv::optflow::createOptFlow_SimpleFlow()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gab3fd0cd6d32cb7cfa169cb72e804d0b4',1,'createOptFlow_SimpleFlow()(Global Namespace)']]], - ['createoptflow_5fsparserlof_1770',['createOptFlow_SparseRLOF',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gadcd2f4b1ecb8ea366bdc23f8f23da7ac',1,'cv::optflow::createOptFlow_SparseRLOF()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gadcd2f4b1ecb8ea366bdc23f8f23da7ac',1,'createOptFlow_SparseRLOF()(Global Namespace)']]], - ['createoptflow_5fsparsetodense_1771',['createOptFlow_SparseToDense',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gae7bcbdec27f2006dde666c5f6c6e232d',1,'cv::optflow::createOptFlow_SparseToDense()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gae7bcbdec27f2006dde666c5f6c6e232d',1,'createOptFlow_SparseToDense()(Global Namespace)']]], - ['createopticalflowneedlemap_1772',['createOpticalFlowNeedleMap',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga0d285cee95d6c70d4976ef191726c1f1',1,'cv::cuda::createOpticalFlowNeedleMap()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga0d285cee95d6c70d4976ef191726c1f1',1,'createOpticalFlowNeedleMap()(Global Namespace)']]], - ['createplanemesh_1773',['createPlaneMesh',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga9214437e592ecc604c736b3575cee5e5',1,'cv::ovis::createPlaneMesh()'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga9214437e592ecc604c736b3575cee5e5',1,'createPlaneMesh()(Global Namespace)']]], - ['createpointcloudmesh_1774',['createPointCloudMesh',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gae9f76a970c4762f125957b3541b4ad3f',1,'cv::ovis::createPointCloudMesh()'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gae9f76a970c4762f125957b3541b4ad3f',1,'createPointCloudMesh()(Global Namespace)']]], - ['createquaternionimage_1775',['createQuaternionImage',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga7e05deed15f29e96b90be1042ef94221',1,'cv::ximgproc::createQuaternionImage()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga7e05deed15f29e96b90be1042ef94221',1,'createQuaternionImage()(Global Namespace)']]], - ['createrffeaturegetter_1776',['createRFFeatureGetter',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html#ga46b9bc71471f61bcbbc05922a1d6db08',1,'cv::ximgproc::createRFFeatureGetter()'],['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html#ga46b9bc71471f61bcbbc05922a1d6db08',1,'createRFFeatureGetter()(Global Namespace)']]], - ['createricinterpolator_1777',['createRICInterpolator',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaa68a46e3af5b9d45e5b5cc4dac7e6240',1,'cv::ximgproc::createRICInterpolator()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaa68a46e3af5b9d45e5b5cc4dac7e6240',1,'createRICInterpolator()(Global Namespace)']]], - ['createrightmatcher_1778',['createRightMatcher',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gae85b598094c2d747f84f22b2aa2c2e0c',1,'cv::ximgproc::createRightMatcher()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gae85b598094c2d747f84f22b2aa2c2e0c',1,'createRightMatcher()(Global Namespace)']]], - ['createrleimage_1779',['createRLEImage',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#gaeb612dd95fb84622846dbb516af7ab88',1,'cv::ximgproc::rl::createRLEImage()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#gaeb612dd95fb84622846dbb516af7ab88',1,'createRLEImage()(Global Namespace)']]], - ['createrowsumfilter_1780',['createRowSumFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaf735de273ccb5072f3c27816fb97a53a',1,'cv::cuda::createRowSumFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaf735de273ccb5072f3c27816fb97a53a',1,'createRowSumFilter()(Global Namespace)']]], - ['createsamesize_1781',['createSameSize',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ae3ba8e4898c218ec5bd19ec0bf2217e0',1,'cv::_OutputArray']]], - ['createscharrfilter_1782',['createScharrFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga4ac8df158e5771ddb0bd5c9091188ce6',1,'cv::cuda::createScharrFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga4ac8df158e5771ddb0bd5c9091188ce6',1,'createScharrFilter()(Global Namespace)']]], - ['createselectivesearchsegmentation_1783',['createSelectiveSearchSegmentation',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga79725490f59e23bba3c774239aa053f1',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentation()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga79725490f59e23bba3c774239aa053f1',1,'createSelectiveSearchSegmentation()(Global Namespace)']]], - ['createselectivesearchsegmentationstrategycolor_1784',['createSelectiveSearchSegmentationStrategyColor',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga28d5bd8d3a9dc8a7c53a4df5ee01421d',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyColor()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga28d5bd8d3a9dc8a7c53a4df5ee01421d',1,'createSelectiveSearchSegmentationStrategyColor()(Global Namespace)']]], - ['createselectivesearchsegmentationstrategyfill_1785',['createSelectiveSearchSegmentationStrategyFill',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga6da434bbb8e34a4f2b4bef838119b7d9',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyFill()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga6da434bbb8e34a4f2b4bef838119b7d9',1,'createSelectiveSearchSegmentationStrategyFill()(Global Namespace)']]], - ['createselectivesearchsegmentationstrategymultiple_1786',['createSelectiveSearchSegmentationStrategyMultiple',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#gaa03c4fdeb0239fc53872a5f941702d4b',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyMultiple()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#gafae74f2d165a207d7c304c66cd9cdf92',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga6a1ee28fec2ccd0c68883fb47ce09732',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1, Ptr< SelectiveSearchSegmentationStrategy > s2)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga1bb0b891b255865f9e1000649d9b693d',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1, Ptr< SelectiveSearchSegmentationStrategy > s2, Ptr< SelectiveSearchSegmentationStrategy > s3)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#gac81ad5c23350c56112dfd1434f76276c',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1, Ptr< SelectiveSearchSegmentationStrategy > s2, Ptr< SelectiveSearchSegmentationStrategy > s3, Ptr< SelectiveSearchSegmentationStrategy > s4)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#gaa03c4fdeb0239fc53872a5f941702d4b',1,'createSelectiveSearchSegmentationStrategyMultiple()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#gafae74f2d165a207d7c304c66cd9cdf92',1,'createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga6a1ee28fec2ccd0c68883fb47ce09732',1,'createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1, Ptr< SelectiveSearchSegmentationStrategy > s2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga1bb0b891b255865f9e1000649d9b693d',1,'createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1, Ptr< SelectiveSearchSegmentationStrategy > s2, Ptr< SelectiveSearchSegmentationStrategy > s3)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#gac81ad5c23350c56112dfd1434f76276c',1,'createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1, Ptr< SelectiveSearchSegmentationStrategy > s2, Ptr< SelectiveSearchSegmentationStrategy > s3, Ptr< SelectiveSearchSegmentationStrategy > s4)(Global Namespace)']]], - ['createselectivesearchsegmentationstrategysize_1787',['createSelectiveSearchSegmentationStrategySize',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga2ddd826e91ca387c263588a863b677e3',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategySize()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga2ddd826e91ca387c263588a863b677e3',1,'createSelectiveSearchSegmentationStrategySize()(Global Namespace)']]], - ['createselectivesearchsegmentationstrategytexture_1788',['createSelectiveSearchSegmentationStrategyTexture',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga4220f4bdb88c0a1a78fe703b7e7f44df',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyTexture()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga4220f4bdb88c0a1a78fe703b7e7f44df',1,'createSelectiveSearchSegmentationStrategyTexture()(Global Namespace)']]], - ['createseparablelinearfilter_1789',['createSeparableLinearFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaf7b79a9a92992044f328dad07a52c4bf',1,'cv::cuda::createSeparableLinearFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaf7b79a9a92992044f328dad07a52c4bf',1,'createSeparableLinearFilter()(Global Namespace)']]], - ['createshapecontextdistanceextractor_1790',['createShapeContextDistanceExtractor',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga3cd728c70ce6284d30189cb9e63a6bd3',1,'cv::createShapeContextDistanceExtractor()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga3cd728c70ce6284d30189cb9e63a6bd3',1,'createShapeContextDistanceExtractor()(Global Namespace)']]], - ['createsimplewb_1791',['createSimpleWB',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga2b48b3b384b5c5ee1b15a2a01c26d5f1',1,'cv::xphoto::createSimpleWB()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga2b48b3b384b5c5ee1b15a2a01c26d5f1',1,'createSimpleWB()(Global Namespace)']]], - ['createsobelfilter_1792',['createSobelFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gabf85fe61958bb21e93211a6fcc7c5c3b',1,'cv::cuda::createSobelFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gabf85fe61958bb21e93211a6fcc7c5c3b',1,'createSobelFilter()(Global Namespace)']]], - ['createstereobeliefpropagation_1793',['createStereoBeliefPropagation',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#ga8d22dd80bdfb4e3d7d2ac09e8a07c22b',1,'cv::cuda::createStereoBeliefPropagation()'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#ga8d22dd80bdfb4e3d7d2ac09e8a07c22b',1,'createStereoBeliefPropagation()(Global Namespace)']]], - ['createstereobm_1794',['createStereoBM',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#ga77edc901350dd0a7f46ec5aca4138039',1,'cv::cuda::createStereoBM()'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#ga77edc901350dd0a7f46ec5aca4138039',1,'createStereoBM()(Global Namespace)']]], - ['createstereoconstantspacebp_1795',['createStereoConstantSpaceBP',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#gaec3b49c7cf9f7701a6f549a227be4df2',1,'cv::cuda::createStereoConstantSpaceBP()'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#gaec3b49c7cf9f7701a6f549a227be4df2',1,'createStereoConstantSpaceBP()(Global Namespace)']]], - ['createstitcher_1796',['createStitcher',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga2de00132401436e7ddc89590994fd922',1,'cv::createStitcher()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga2de00132401436e7ddc89590994fd922',1,'createStitcher()(Global Namespace)']]], - ['createstitcherscans_1797',['createStitcherScans',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga5b928eb0ff52ec148f6cfa89b6a0af25',1,'cv::createStitcherScans()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga5b928eb0ff52ec148f6cfa89b6a0af25',1,'createStitcherScans()(Global Namespace)']]], - ['createstructurededgedetection_1798',['createStructuredEdgeDetection',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html#ga39029b3c6691b0314b53c68c79d5b788',1,'cv::ximgproc::createStructuredEdgeDetection()'],['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html#ga39029b3c6691b0314b53c68c79d5b788',1,'createStructuredEdgeDetection()(Global Namespace)']]], - ['createsuperpixellsc_1799',['createSuperpixelLSC',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#ga437341bd2bc5c7a9806450063fd5c5a3',1,'cv::ximgproc::createSuperpixelLSC()'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#ga437341bd2bc5c7a9806450063fd5c5a3',1,'createSuperpixelLSC()(Global Namespace)']]], - ['createsuperpixelseeds_1800',['createSuperpixelSEEDS',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gabda19d839f775cbb527fffec133bc4ea',1,'cv::ximgproc::createSuperpixelSEEDS()'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gabda19d839f775cbb527fffec133bc4ea',1,'createSuperpixelSEEDS()(Global Namespace)']]], - ['createsuperpixelslic_1801',['createSuperpixelSLIC',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gacf29df20eaca242645a8d3a2d88e6c06',1,'cv::ximgproc::createSuperpixelSLIC()'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gacf29df20eaca242645a8d3a2d88e6c06',1,'createSuperpixelSLIC()(Global Namespace)']]], - ['createsuperresolution_5fbtvl1_1802',['createSuperResolution_BTVL1',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga73c184b0040c1afa7d6cdf0a9f32a8f8',1,'cv::superres::createSuperResolution_BTVL1()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga73c184b0040c1afa7d6cdf0a9f32a8f8',1,'createSuperResolution_BTVL1()(Global Namespace)']]], - ['createsuperresolution_5fbtvl1_5fcuda_1803',['createSuperResolution_BTVL1_CUDA',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gaea2902c2e948f7629df286252d598c4d',1,'cv::superres::createSuperResolution_BTVL1_CUDA()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gaea2902c2e948f7629df286252d598c4d',1,'createSuperResolution_BTVL1_CUDA()(Global Namespace)']]], - ['createsyntheticsequencegenerator_1804',['createSyntheticSequenceGenerator',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga4dcae4825e43d6ba54487ddc7a85cbb4',1,'cv::bgsegm::createSyntheticSequenceGenerator()'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga4dcae4825e43d6ba54487ddc7a85cbb4',1,'createSyntheticSequenceGenerator()(Global Namespace)']]], - ['createtemplatematching_1805',['createTemplateMatching',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gad23350ed16d9b010d96c5ef76ccc29d0',1,'cv::cuda::createTemplateMatching()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gad23350ed16d9b010d96c5ef76ccc29d0',1,'createTemplateMatching()(Global Namespace)']]], - ['createthinplatesplineshapetransformer_1806',['createThinPlateSplineShapeTransformer',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga624261564326d735bc6af7cb4e27bb95',1,'cv::createThinPlateSplineShapeTransformer()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga624261564326d735bc6af7cb4e27bb95',1,'createThinPlateSplineShapeTransformer()(Global Namespace)']]], - ['createtonemap_1807',['createTonemap',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gabcbd653140b93a1fa87ccce94548cd0d',1,'cv::createTonemap()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gabcbd653140b93a1fa87ccce94548cd0d',1,'createTonemap()(Global Namespace)']]], - ['createtonemapdrago_1808',['createTonemapDrago',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga72bf92bb6b8653ee4be650ac01cf50b6',1,'cv::createTonemapDrago()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga72bf92bb6b8653ee4be650ac01cf50b6',1,'createTonemapDrago()(Global Namespace)']]], - ['createtonemapdurand_1809',['createTonemapDurand',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gaa260080c493ecc2c639610eddef00cbf',1,'cv::xphoto::createTonemapDurand()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gaa260080c493ecc2c639610eddef00cbf',1,'createTonemapDurand()(Global Namespace)']]], - ['createtonemapmantiuk_1810',['createTonemapMantiuk',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga3b3f3bf083b7515802f039a6a70f2d21',1,'cv::createTonemapMantiuk()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga3b3f3bf083b7515802f039a6a70f2d21',1,'createTonemapMantiuk()(Global Namespace)']]], - ['createtonemapreinhard_1811',['createTonemapReinhard',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gadabe7f6bf1fa96ad0fd644df9182c2fb',1,'cv::createTonemapReinhard()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gadabe7f6bf1fa96ad0fd644df9182c2fb',1,'createTonemapReinhard()(Global Namespace)']]], - ['createtrackbar_1812',['createTrackbar',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gaf78d2155d30b728fc413803745b67a9b',1,'cv::createTrackbar()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gaf78d2155d30b728fc413803745b67a9b',1,'createTrackbar()(Global Namespace)']]], - ['createtrackerbymatching_1813',['createTrackerByMatching',['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#adf142df760e16bcd832478934598e2d0',1,'cv::tbm']]], - ['createtrianglemesh_1814',['createTriangleMesh',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga5648ab6b81d2764eb1865ca55fe95e80',1,'cv::ovis::createTriangleMesh()'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga5648ab6b81d2764eb1865ca55fe95e80',1,'createTriangleMesh()(Global Namespace)']]], - ['createunscentedkalmanfilter_1815',['createUnscentedKalmanFilter',['https://docs.opencv.org/4.2.0/da/dd0/namespacecv_1_1tracking.html#a96e8c1ceaef27ab6f87cc414a7a7ee6a',1,'cv::tracking']]], - ['createvideoreader_1816',['createVideoReader',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gafd67042ff937f5152fa1b682c5c589ed',1,'cv::cudacodec::createVideoReader(const String &filename)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gac5a44b5a3d7b50ce7bcafaf75a2cfedf',1,'cv::cudacodec::createVideoReader(const Ptr< RawVideoSource > &source)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gafd67042ff937f5152fa1b682c5c589ed',1,'createVideoReader(const String &filename)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gac5a44b5a3d7b50ce7bcafaf75a2cfedf',1,'createVideoReader(const Ptr< RawVideoSource > &source)(Global Namespace)']]], - ['createvideowriter_1817',['createVideoWriter',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga265e7194b875468be41f5b1a008c622f',1,'cv::cudacodec::createVideoWriter(const String &fileName, Size frameSize, double fps, SurfaceFormat format=SF_BGR)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga6478d4c46cb033e9fcf49b458291fe52',1,'cv::cudacodec::createVideoWriter(const String &fileName, Size frameSize, double fps, const EncoderParams &params, SurfaceFormat format=SF_BGR)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga6773e8f1e9c05cc801234a694862b3e2',1,'cv::cudacodec::createVideoWriter(const Ptr< EncoderCallBack > &encoderCallback, Size frameSize, double fps, SurfaceFormat format=SF_BGR)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga14b9eec8c0c5bbbce0da1884c51f8173',1,'cv::cudacodec::createVideoWriter(const Ptr< EncoderCallBack > &encoderCallback, Size frameSize, double fps, const EncoderParams &params, SurfaceFormat format=SF_BGR)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga265e7194b875468be41f5b1a008c622f',1,'createVideoWriter(const String &fileName, Size frameSize, double fps, SurfaceFormat format=SF_BGR)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga6478d4c46cb033e9fcf49b458291fe52',1,'createVideoWriter(const String &fileName, Size frameSize, double fps, const EncoderParams &params, SurfaceFormat format=SF_BGR)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga6773e8f1e9c05cc801234a694862b3e2',1,'createVideoWriter(const Ptr< EncoderCallBack > &encoderCallback, Size frameSize, double fps, SurfaceFormat format=SF_BGR)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga14b9eec8c0c5bbbce0da1884c51f8173',1,'createVideoWriter(const Ptr< EncoderCallBack > &encoderCallback, Size frameSize, double fps, const EncoderParams &params, SurfaceFormat format=SF_BGR)(Global Namespace)']]], - ['createweightmap_1818',['createWeightMap',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga44acdfd65d4502ff8d66ee9efd5cb2c9',1,'cv::detail::createWeightMap()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga44acdfd65d4502ff8d66ee9efd5cb2c9',1,'createWeightMap()(Global Namespace)']]], - ['createweightmaps_1819',['createWeightMaps',['https://docs.opencv.org/4.2.0/d4/d69/classcv_1_1detail_1_1FeatherBlender.html#a8ce9b0e8ccc9cbf68d935782e14e37d3',1,'cv::detail::FeatherBlender']]], - ['createwindow_1820',['createWindow',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gae540577f6f783d26c37319663c8245ad',1,'cv::ovis::createWindow()'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gae540577f6f783d26c37319663c8245ad',1,'createWindow(const String &title, const Size &size, int flags=SCENE_INTERACTIVE|SCENE_AA)(Global Namespace)']]], - ['creating_20a_203d_20histogram_1821',['Creating a 3D histogram',['https://docs.opencv.org/4.2.0/d1/d1d/tutorial_histo3D.html',1,'']]], - ['creating_20a_20video_20with_20opencv_1822',['Creating a video with OpenCV',['https://docs.opencv.org/4.2.0/d7/d9e/tutorial_video_write.html',1,'']]], - ['creating_20bounding_20boxes_20and_20circles_20for_20contours_1823',['Creating Bounding boxes and circles for contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'']]], - ['creating_20bounding_20rotated_20boxes_20and_20ellipses_20for_20contours_1824',['Creating Bounding rotated boxes and ellipses for contours',['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'']]], - ['creating_20groups_1825',['Creating Groups',['https://docs.opencv.org/4.2.0/d1/d8b/tutorial_hdf_create_groups.html',1,'']]], - ['creating_20widgets_1826',['Creating Widgets',['https://docs.opencv.org/4.2.0/d2/d64/tutorial_creating_widgets.html',1,'']]], - ['creating_20writing_20and_20reading_20datasets_1827',['Creating, Writing and Reading Datasets',['https://docs.opencv.org/4.2.0/d4/d93/tutorial_hdf_create_read_write_datasets.html',1,'']]], - ['creating_20your_20own_20corner_20detector_1828',['Creating your own corner detector',['https://docs.opencv.org/4.2.0/d9/dbc/tutorial_generic_corner_detector.html',1,'']]], - ['creating_5fwidgets_2emarkdown_1829',['creating_widgets.markdown',['https://docs.opencv.org/4.2.0/da/d9a/creating__widgets_8markdown.html',1,'']]], - ['creation_20functions_1830',['Array creation functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01523.html',1,'']]], - ['creative_20senz3d_20and_20other_20intel_20perceptual_20computing_20sdk_20compatible_20depth_20sensors_1831',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], - ['cref_1832',['cref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afc6f7bb2ebc4f03c54cdf91f5ecb1f15',1,'std::cref(const _Tp &__t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2368fbf8f54b8df5ea09bd447dd07ab5',1,'std::cref(const _Tp &&)=delete'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a173f93c3bca58d0411f16989cce6fedc',1,'std::cref(reference_wrapper< _Tp > __t) noexcept']]], - ['cregex_5ftoken_5fiterator_1833',['cregex_token_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga2b025ba2913cd0f7266ddbea7eb2c915',1,'std::cregex_token_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga2b025ba2913cd0f7266ddbea7eb2c915',1,'cregex_token_iterator(Global Namespace)']]], - ['crend_1834',['crend',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#af1e98d795f3b288cff0e0ead0b882634',1,'__gnu_cxx::__versa_string::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< _CharT >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< _CharT, _Traits, _Allocator >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< char >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< char, char_traits< char >, _Byte_alloc >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< char_type, _Traits, _Alloc >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< value_type >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a17d738d29f26320ce991399537a17bce',1,'deque< _StateSeqT >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#af9bc7bbe49c3f41b0dfaa3acd5c89e12',1,'list< __inp, __rebind_inp >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'match_results< _Bi_iter >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'std::basic_string::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a17d738d29f26320ce991399537a17bce',1,'std::deque::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#af9bc7bbe49c3f41b0dfaa3acd5c89e12',1,'std::list::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#adbd5c263f187f16ca9f073e1789a02ff',1,'std::map::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'std::match_results::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a5677edc45a056a95ea1455378f2aa903',1,'std::multimap::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a23f0dc41c6813e1628a1acf9c1966c8b',1,'std::multiset::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#abb253be090c388adfba1f54046c0f416',1,'std::set::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'std::vector::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< __diff_type >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _CharClassT >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _CharT >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _Cmpt >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _Node *, _Nodeptr_Alloc >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _RealType >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _State< _TraitsT::char_type > >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _StringT >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< block_type, allocator_type >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< Catalog_info * >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< double >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< int >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< result_type >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< size_t >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< std::pair< _BiIter, int > >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< std::pair< _StateIdT, std::vector > >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< std::pair< _StrTransT, _StrTransT > >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< sub_match< _Bi_iter >, _Alloc >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< sub_match< _BiIter >, _Alloc >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'Eigen::VectorwiseOp::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const Derived, Horizontal >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const Derived, Vertical >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::crend()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a223480466a0922267d680ec8f0722d58.html#a223480466a0922267d680ec8f0722d58',1,'nlohmann::basic_json::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a302a9b43f7a45e54827072d23d6682f5',1,'std::crend()']]], - ['crop_1835',['CROP',['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#af76d4f81be079787300899fbfaaf92d3af0f3167875e479f3b72c2c2917077b58',1,'cv::detail::Timelapser']]], - ['crop_1836',['crop',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gae72ac2d6fec8d4e636a7d72d37e70895',1,'cv::gapi::crop()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gae72ac2d6fec8d4e636a7d72d37e70895',1,'crop()(Global Namespace)']]], - ['cropandresizelayer_1837',['CropAndResizeLayer',['https://docs.opencv.org/4.2.0/d8/d53/classcv_1_1dnn_1_1CropAndResizeLayer.html',1,'cv::dnn']]], - ['croplayer_1838',['CropLayer',['https://docs.opencv.org/4.2.0/d7/d86/classcv_1_1dnn_1_1CropLayer.html',1,'cv::dnn']]], - ['cross_1839',['cross',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a708b761e0d15b7b8db4c8e8c95a7abe9',1,'cv::Mat::cross()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac0309f2c3e9df59cbe1315b671040da2',1,'cv::Mat_::cross()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac0309f2c3e9df59cbe1315b671040da2',1,'Mat_< double >::cross()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac0309f2c3e9df59cbe1315b671040da2',1,'Mat_< float >::cross()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac0309f2c3e9df59cbe1315b671040da2',1,'Mat_< uchar >::cross()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac0309f2c3e9df59cbe1315b671040da2',1,'Mat_< unsigned char >::cross()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8bf0a7608d14009f0e946f35b813ccaa',1,'cv::MatExpr::cross()'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a4f8bf249885e00c31a4f63565bf4df15',1,'cv::Point3_::cross()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a946769d5545dba5d328486602aae2ac3',1,'cv::Point_::cross()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a946769d5545dba5d328486602aae2ac3',1,'Point_< double >::cross()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a946769d5545dba5d328486602aae2ac3',1,'Point_< float >::cross()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a946769d5545dba5d328486602aae2ac3',1,'Point_< int >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'cv::Vec::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< _Tp, 4 >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< double, 2 >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< double, 3 >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< double, 4 >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< double, GPCPatchDescriptor::nFeatures >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< double, nFeatures >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< float, 2 >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< float, 3 >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga0024b44eca99cb7135887c2aaf319d28',1,'Eigen::MatrixBase::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga0024b44eca99cb7135887c2aaf319d28',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga0024b44eca99cb7135887c2aaf319d28',1,'MatrixBase< Solve< Decomposition, RhsType > >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'Eigen::VectorwiseOp::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const Derived, Horizontal >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const Derived, Vertical >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::cross()'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac486a777bd8cd6f37ada22cdd8c09f49',1,'cv::datasets::cross'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac486a777bd8cd6f37ada22cdd8c09f49',1,'cross(Global Namespace)'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga0024b44eca99cb7135887c2aaf319d28',1,'cross(const MatrixBase< OtherDerived > &other) const(Global Namespace)']]], - ['cross_20compilation_20for_20arm_20based_20linux_20systems_1840',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]], - ['cross_20referencing_20opencv_20from_20other_20doxygen_20projects_1841',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], - ['cross3_1842',['cross3',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gabde56e2a0baba550815a0b05139e4d42',1,'Eigen::MatrixBase::cross3()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gabde56e2a0baba550815a0b05139e4d42',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::cross3()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gabde56e2a0baba550815a0b05139e4d42',1,'MatrixBase< Solve< Decomposition, RhsType > >::cross3()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gabde56e2a0baba550815a0b05139e4d42',1,'cross3()(Global Namespace)']]], - ['crosscheck_1843',['crossCheck',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#a4fd61f0e8a770d4a23c47e7f6240c6ba',1,'cv::BFMatcher']]], - ['crossings_1844',['crossings',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a36855f1539c64327dbef1fed241a8219',1,'cv::text::ERStat']]], - ['crosssegmentationthreshold_1845',['crossSegmentationThreshold',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#aee99954ef8164f5441dcf10e08121313',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['csetjmp_1846',['csetjmp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00218.html',1,'']]], - ['cshift_1847',['cshift',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5763723f8e15f612889a2d93625649db',1,'std::valarray::cshift()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5763723f8e15f612889a2d93625649db',1,'valarray< size_t >::cshift()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5763723f8e15f612889a2d93625649db',1,'cshift(int __n) const(Global Namespace)']]], - ['csignal_1848',['csignal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00221.html',1,'']]], - ['cstdalign_1849',['cstdalign',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00224.html',1,'']]], - ['cstdarg_1850',['cstdarg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00227.html',1,'']]], - ['cstdbool_1851',['cstdbool',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00230.html',1,'']]], - ['cstddef_1852',['cstddef',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00233.html',1,'']]], - ['cstdint_1853',['cstdint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00236.html',1,'']]], - ['cstdio_1854',['cstdio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00239.html',1,'']]], - ['cstdlib_1855',['cstdlib',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00242.html',1,'']]], - ['cstring_1856',['cstring',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00245.html',1,'']]], - ['csub_5fmatch_1857',['csub_match',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga29090c6f0fdf0d3241cf79e759838eeb',1,'std::csub_match'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga29090c6f0fdf0d3241cf79e759838eeb',1,'csub_match(Global Namespace)']]], - ['ct_5fassert_5ffailure_1858',['CT_ASSERT_FAILURE',['https://docs.opencv.org/4.2.0/da/d73/structNcvCTprep_1_1CT__ASSERT__FAILURE.html',1,'NcvCTprep']]], - ['ct_5fassert_5ffailure_3c_20true_20_3e_1859',['CT_ASSERT_FAILURE< true >',['https://docs.opencv.org/4.2.0/dc/dcf/structNcvCTprep_1_1CT__ASSERT__FAILURE_3_01true_01_4.html',1,'NcvCTprep']]], - ['ctgmath_1860',['ctgmath',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00248.html',1,'']]], - ['ctime_1861',['ctime',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00251.html',1,'']]], - ['ctrl_1862',['CTRL',['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#aaee8f2a3f0f04415acca5f1ada1ce8edafd3c745ae0bd40c386991c4e3604747c',1,'cv::viz::KeyboardEvent']]], - ['ctype_1863',['ctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html',1,'std::ctype< _CharT >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a283927e767f737e4ef7a7ccd0bec1da1',1,'std::locale::ctype'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#acf81454de90c003b463e19f8703c1cbb',1,'std::ctype< char >::ctype(const mask *__table=0, bool __del=false, size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a00afd225d281cd0a8cd3f35611dd91f9',1,'std::ctype< char >::ctype(__c_locale __cloc, const mask *__table=0, bool __del=false, size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a1151154fd754cfa479a1d4b52a561435',1,'std::ctype< wchar_t >::ctype(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#aea37b8246f8796aa91522d5bcd8c87a3',1,'std::ctype< wchar_t >::ctype(__c_locale __cloc, size_t __refs=0)']]], - ['ctype_3c_20char_20_3e_1864',['ctype< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html',1,'std']]], - ['ctype_3c_20wchar_5ft_20_3e_1865',['ctype< wchar_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html',1,'std']]], - ['ctype_5fbase_1866',['ctype_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08503.html',1,'std']]], - ['ctype_5fbase_2eh_1867',['ctype_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00680.html',1,'']]], - ['ctype_5fbyname_1868',['ctype_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05931.html',1,'std']]], - ['ctype_5fbyname_3c_20char_20_3e_1869',['ctype_byname< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05935.html',1,'std']]], - ['ctype_5finline_2eh_1870',['ctype_inline.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00683.html',1,'']]], - ['cube_1871',['cube',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae04fac7e3068f05c3f01982554a21d80',1,'Eigen']]], - ['cuberoot_1872',['cubeRoot',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga51452a9a5b6b232e0d67855c8e27f436',1,'cv::cubeRoot()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga51452a9a5b6b232e0d67855c8e27f436',1,'cubeRoot()(Global Namespace)']]], - ['cubicinterptr_1873',['CubicInterPtr',['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1CubicInterPtr.html',1,'cv::cudev']]], - ['cubicinterptrsz_1874',['CubicInterPtrSz',['https://docs.opencv.org/4.2.0/d2/d00/structcv_1_1cudev_1_1CubicInterPtrSz.html',1,'cv::cudev']]], - ['cuchar_1875',['cuchar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00257.html',1,'']]], - ['cuda_1876',['Building OpenCV for Tegra with CUDA',['https://docs.opencv.org/4.2.0/d6/d15/tutorial_building_tegra_cuda.html',1,'']]], - ['cuda_20accelerated_20computer_20vision_1877',['CUDA-accelerated Computer Vision',['https://docs.opencv.org/4.2.0/d1/d1e/group__cuda.html',1,'']]], - ['cuda_20kernels_1878',['Using Eigen in CUDA kernels',['https://eigen.tuxfamily.org/dox/TopicCUDA.html',1,'']]], - ['cuda_20module_1879',['GPU-Accelerated Computer Vision (cuda module)',['https://docs.opencv.org/4.2.0/da/d2c/tutorial_table_of_content_gpu.html',1,'']]], - ['cuda_20module_20introduction_1880',['CUDA Module Introduction',['https://docs.opencv.org/4.2.0/d2/dbc/cuda_intro.html',1,'']]], - ['cuda_2ehpp_1881',['cuda.hpp',['https://docs.opencv.org/4.2.0/d8/dd1/modules_2core_2include_2opencv2_2core_2cuda_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d7d/modules_2photo_2include_2opencv2_2photo_2cuda_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d44/contrib_2modules_2xfeatures2d_2include_2opencv2_2xfeatures2d_2cuda_8hpp.html',1,'(Global Namespace)']]], - ['cuda_2emarkdown_1882',['cuda.markdown',['https://docs.opencv.org/4.2.0/d5/d00/cuda_8markdown.html',1,'']]], - ['cuda_5fgpu_5fmat_1883',['CUDA_GPU_MAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba131b6b2d8f36c9310bf1b2e382e85225',1,'cv::_InputArray']]], - ['cuda_5fhost_5fmem_1884',['CUDA_HOST_MEM',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba7738c968c10d86fc85092882e41e0d77',1,'cv::_InputArray']]], - ['cuda_5fstream_5faccessor_2ehpp_1885',['cuda_stream_accessor.hpp',['https://docs.opencv.org/4.2.0/d3/de8/cuda__stream__accessor_8hpp.html',1,'']]], - ['cuda_5ftypes_2ehpp_1886',['cuda_types.hpp',['https://docs.opencv.org/4.2.0/de/db2/cuda__types_8hpp.html',1,'']]], - ['cudaarithm_2ehpp_1887',['cudaarithm.hpp',['https://docs.opencv.org/4.2.0/d4/d03/cudaarithm_8hpp.html',1,'']]], - ['cudabgsegm_2ehpp_1888',['cudabgsegm.hpp',['https://docs.opencv.org/4.2.0/dc/d3d/cudabgsegm_8hpp.html',1,'']]], - ['cudacodec_2ehpp_1889',['cudacodec.hpp',['https://docs.opencv.org/4.2.0/dd/d4e/cudacodec_8hpp.html',1,'']]], - ['cudafeatures2d_2ehpp_1890',['cudafeatures2d.hpp',['https://docs.opencv.org/4.2.0/d7/d0a/cudafeatures2d_8hpp.html',1,'']]], - ['cudafilters_2ehpp_1891',['cudafilters.hpp',['https://docs.opencv.org/4.2.0/da/dc5/cudafilters_8hpp.html',1,'']]], - ['cudaimgproc_2ehpp_1892',['cudaimgproc.hpp',['https://docs.opencv.org/4.2.0/de/de4/cudaimgproc_8hpp.html',1,'']]], - ['cudalegacy_2ehpp_1893',['cudalegacy.hpp',['https://docs.opencv.org/4.2.0/da/d10/cudalegacy_8hpp.html',1,'']]], - ['cudaobjdetect_2ehpp_1894',['cudaobjdetect.hpp',['https://docs.opencv.org/4.2.0/d2/df3/cudaobjdetect_8hpp.html',1,'']]], - ['cudaoptflow_2ehpp_1895',['cudaoptflow.hpp',['https://docs.opencv.org/4.2.0/d2/d43/cudaoptflow_8hpp.html',1,'']]], - ['cudastereo_2ehpp_1896',['cudastereo.hpp',['https://docs.opencv.org/4.2.0/d8/d60/cudastereo_8hpp.html',1,'']]], - ['cudawarping_2ehpp_1897',['cudawarping.hpp',['https://docs.opencv.org/4.2.0/d1/d3d/cudawarping_8hpp.html',1,'']]], - ['cudev_2ehpp_1898',['cudev.hpp',['https://docs.opencv.org/4.2.0/d6/d38/cudev_8hpp.html',1,'']]], - ['cur_1899',['cur',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'basic_ios< char, _Traits >::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'basic_iostream< char >::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'basic_istream< char >::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'basic_istream< char, _Traits >::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'basic_ostream< char >::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'basic_ostream< char, _Traits >::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_fstream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_ifstream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_ios::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_iostream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_istream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_istringstream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_ofstream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_ostream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_ostringstream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_stringstream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::ios_base::cur']]], - ['curpos_5f_1900',['curPos_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a1aad590502b048b61f749435c44e22ea',1,'cv::videostab::StabilizerBase']]], - ['curr_5fsymbol_1901',['curr_symbol',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a14f1dcb29d715a787f93e43a84b3dbef',1,'std::moneypunct::curr_symbol()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a14f1dcb29d715a787f93e43a84b3dbef',1,'std::moneypunct_byname::curr_symbol()']]], - ['currallocator_1902',['currAllocator',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a7e737c9fe94d01dc12729e2dcea38485',1,'cv::UMatData']]], - ['current_5fexception_1903',['current_exception',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#ga02cdcc517fefe661313437aa9356a28f',1,'std::current_exception()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#ga02cdcc517fefe661313437aa9356a28f',1,'current_exception()(Global Namespace)']]], - ['currentconfidencemap_1904',['currentConfidenceMap',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a6e7c4c6d8aac7806728d858b3e64d6c3',1,'cv::TrackerModel']]], - ['currentdeviceorientation_1905',['currentDeviceOrientation',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#aa46cf6e9afd8398d35b99cef4f3247f7',1,'CvAbstractCamera']]], - ['curstabilizedpos_5f_1906',['curStabilizedPos_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a0c5cefe4d769bd32a238474101e31ecf',1,'cv::videostab::StabilizerBase']]], - ['custom_1907',['CUSTOM',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56adc68154e13627786e405117dd64012a5',1,'cv::ml::SVM::CUSTOM'],['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#a2a97c5b832651524b8e782496b933d45a71ad55cb912f219c15e587847c07b0fb',1,'cv::TrackerKCF::CUSTOM']]], - ['custom_20calibration_20pattern_20for_203d_20reconstruction_1908',['Custom Calibration Pattern for 3D reconstruction',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html',1,'']]], - ['custom_20deep_20learning_20layers_20support_1909',['Custom deep learning layers support',['https://docs.opencv.org/4.2.0/dc/db1/tutorial_dnn_custom_layers.html',1,'']]], - ['custom_20scalar_20types_1910',['Using custom scalar types',['https://eigen.tuxfamily.org/dox/TopicCustomizing_CustomScalar.html',1,'']]], - ['customizing_20eigen_1911',['Extending/Customizing Eigen',['https://eigen.tuxfamily.org/dox/UserManual_CustomizingEigen.html',1,'']]], - ['customizing_20the_20cn_20tracker_1912',['Customizing the CN Tracker',['https://docs.opencv.org/4.2.0/dc/db8/tutorial_customizing_cn_tracker.html',1,'']]], - ['custompattern_1913',['CustomPattern',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html',1,'cv::ccalib::CustomPattern'],['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a72a983859063dbab6b82b3f9b3de7fdd',1,'cv::ccalib::CustomPattern::CustomPattern()']]], - ['custompreviewlayer_1914',['customPreviewLayer',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#a46d53b968c51c20e96ef8947444b726d',1,'CvVideoCamera']]], - ['cv_1915',['cv',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html',1,'']]], - ['cv_20application_1916',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], - ['cv16suf_1917',['Cv16suf',['https://docs.opencv.org/4.2.0/dd/d0f/unionCv16suf.html',1,'']]], - ['cv2eigen_1918',['cv2eigen',['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga28d4c291bb74c3b915e2fd62f03906b1',1,'cv::cv2eigen(const Mat &src, Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gaaed24d680285c19716286aa24ae7a579',1,'cv::cv2eigen(const Matx< _Tp, _rows, _cols > &src, Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga5df03dfca2194b7cb59266bcf72f2246',1,'cv::cv2eigen(const Mat &src, Eigen::Matrix< _Tp, Eigen::Dynamic, Eigen::Dynamic > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga3f3a879a3af721ecde8d149dbfc7eeb7',1,'cv::cv2eigen(const Matx< _Tp, _rows, _cols > &src, Eigen::Matrix< _Tp, Eigen::Dynamic, Eigen::Dynamic > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga137921303143b3f17de1307b1feb0860',1,'cv::cv2eigen(const Mat &src, Eigen::Matrix< _Tp, Eigen::Dynamic, 1 > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gaeaf7bbf5b36b766deeaf0c529717ccbb',1,'cv::cv2eigen(const Matx< _Tp, _rows, 1 > &src, Eigen::Matrix< _Tp, Eigen::Dynamic, 1 > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gafd7f2b330fe822f42f918f848ca21dd5',1,'cv::cv2eigen(const Mat &src, Eigen::Matrix< _Tp, 1, Eigen::Dynamic > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gaa57eee0d2918816f75823d9941f1db7b',1,'cv::cv2eigen(const Matx< _Tp, 1, _cols > &src, Eigen::Matrix< _Tp, 1, Eigen::Dynamic > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga28d4c291bb74c3b915e2fd62f03906b1',1,'cv2eigen(const Mat &src, Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gaaed24d680285c19716286aa24ae7a579',1,'cv2eigen(const Matx< _Tp, _rows, _cols > &src, Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga5df03dfca2194b7cb59266bcf72f2246',1,'cv2eigen(const Mat &src, Eigen::Matrix< _Tp, Eigen::Dynamic, Eigen::Dynamic > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga3f3a879a3af721ecde8d149dbfc7eeb7',1,'cv2eigen(const Matx< _Tp, _rows, _cols > &src, Eigen::Matrix< _Tp, Eigen::Dynamic, Eigen::Dynamic > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga137921303143b3f17de1307b1feb0860',1,'cv2eigen(const Mat &src, Eigen::Matrix< _Tp, Eigen::Dynamic, 1 > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gaeaf7bbf5b36b766deeaf0c529717ccbb',1,'cv2eigen(const Matx< _Tp, _rows, 1 > &src, Eigen::Matrix< _Tp, Eigen::Dynamic, 1 > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gafd7f2b330fe822f42f918f848ca21dd5',1,'cv2eigen(const Mat &src, Eigen::Matrix< _Tp, 1, Eigen::Dynamic > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gaa57eee0d2918816f75823d9941f1db7b',1,'cv2eigen(const Matx< _Tp, 1, _cols > &src, Eigen::Matrix< _Tp, 1, Eigen::Dynamic > &dst)(Global Namespace)']]], - ['cv32suf_1919',['Cv32suf',['https://docs.opencv.org/4.2.0/d9/df3/unionCv32suf.html',1,'']]], - ['cv64suf_1920',['Cv64suf',['https://docs.opencv.org/4.2.0/de/d55/unionCv64suf.html',1,'']]], - ['cv_3a_3aaruco_1921',['aruco',['https://docs.opencv.org/4.2.0/d4/d17/namespacecv_1_1aruco.html',1,'cv']]], - ['cv_3a_3abgsegm_1922',['bgsegm',['https://docs.opencv.org/4.2.0/df/d5d/namespacecv_1_1bgsegm.html',1,'cv']]], - ['cv_3a_3abioinspired_1923',['bioinspired',['https://docs.opencv.org/4.2.0/d2/d81/namespacecv_1_1bioinspired.html',1,'cv']]], - ['cv_3a_3abioinspired_3a_3aretinaparameters_1924',['RetinaParameters',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html',1,'cv::bioinspired']]], - ['cv_3a_3accalib_1925',['ccalib',['https://docs.opencv.org/4.2.0/d7/d94/namespacecv_1_1ccalib.html',1,'cv']]], - ['cv_3a_3acnn_5f3dobj_1926',['cnn_3dobj',['https://docs.opencv.org/4.2.0/d9/d57/namespacecv_1_1cnn__3dobj.html',1,'cv']]], - ['cv_3a_3acuda_1927',['cuda',['https://docs.opencv.org/4.2.0/d1/d1a/namespacecv_1_1cuda.html',1,'cv']]], - ['cv_3a_3acuda_3a_3agpumat_1928',['GpuMat',['https://docs.opencv.org/4.2.0/df/d98/classcv_1_1cuda_1_1GpuMat_1_1Allocator.html',1,'cv::cuda']]], - ['cv_3a_3acuda_3a_3agpumat_20with_20thrust_1929',['Using a cv::cuda::GpuMat with thrust',['https://docs.opencv.org/4.2.0/d8/db9/tutorial_gpu_thrust_interop.html',1,'']]], - ['cv_3a_3acudacodec_1930',['cudacodec',['https://docs.opencv.org/4.2.0/d0/de6/namespacecv_1_1cudacodec.html',1,'cv']]], - ['cv_3a_3acudev_1931',['cudev',['https://docs.opencv.org/4.2.0/df/d1d/namespacecv_1_1cudev.html',1,'cv']]], - ['cv_3a_3acudev_3a_3acolor_5fcvt_5fdetail_1932',['color_cvt_detail',['https://docs.opencv.org/4.2.0/df/d47/classcv_1_1cudev_1_1color__cvt__detail_1_1Gray2RGB.html',1,'cv::cudev']]], - ['cv_3a_3acudev_3a_3afunctional_5fdetail_1933',['functional_detail',['https://docs.opencv.org/4.2.0/d8/db9/namespacecv_1_1cudev_1_1functional__detail.html',1,'cv::cudev']]], - ['cv_3a_3acudev_3a_3asum_1934',['Sum',['https://docs.opencv.org/4.2.0/d1/d1d/structcv_1_1cudev_1_1Sum_1_1rebind.html',1,'cv::cudev']]], - ['cv_3a_3acudev_3a_3avec_5fmath_5fdetail_1935',['vec_math_detail',['https://docs.opencv.org/4.2.0/d8/d80/namespacecv_1_1cudev_1_1vec__math__detail.html',1,'cv::cudev']]], - ['cv_3a_3adatasets_1936',['datasets',['https://docs.opencv.org/4.2.0/d0/d44/namespacecv_1_1datasets.html',1,'cv']]], - ['cv_3a_3adescriptormatcher_1937',['DescriptorMatcher',['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html',1,'cv']]], - ['cv_3a_3adetail_1938',['detail',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html',1,'cv']]], - ['cv_3a_3adetail_3a_3ahas_5fcustom_5fwrap_1939',['has_custom_wrap',['https://docs.opencv.org/4.2.0/dd/d16/classcv_1_1detail_1_1has__custom__wrap_1_1check.html',1,'cv::detail']]], - ['cv_3a_3adetail_3a_3aoclcallhelper_1940',['OCLCallHelper',['https://docs.opencv.org/4.2.0/d5/def/structcv_1_1detail_1_1OCLCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_1tua67cc2fc13da93c8cd58afcdf4d9cddf.html',1,'cv::detail']]], - ['cv_3a_3adetail_3a_3aocvcallhelper_1941',['OCVCallHelper',['https://docs.opencv.org/4.2.0/df/de6/structcv_1_1detail_1_1OCVCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_1tu8bfb77c34485398698447f60ee067830.html',1,'cv::detail']]], - ['cv_3a_3adetails_1942',['details',['https://docs.opencv.org/4.2.0/d9/d9e/namespacecv_1_1details.html',1,'cv']]], - ['cv_3a_3adetails_3a_3atlsstorage_1943',['TlsStorage',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#aa3eac24e60c6a2312e113759cb3ed391',1,'cv::TLSDataContainer']]], - ['cv_3a_3adirectx_1944',['directx',['https://docs.opencv.org/4.2.0/d9/d12/namespacecv_1_1directx.html',1,'cv']]], - ['cv_3a_3adirectx_3a_3aocl_1945',['ocl',['https://docs.opencv.org/4.2.0/dd/d58/namespacecv_1_1directx_1_1ocl.html',1,'cv::directx']]], - ['cv_3a_3adnn_1946',['dnn',['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html',1,'cv']]], - ['cv_3a_3adnn_3a_3adetails_1947',['details',['https://docs.opencv.org/4.2.0/de/db0/namespacecv_1_1dnn_1_1details.html',1,'cv::dnn']]], - ['cv_3a_3adnn_5fobjdetect_1948',['dnn_objdetect',['https://docs.opencv.org/4.2.0/d9/d16/namespacecv_1_1dnn__objdetect.html',1,'cv']]], - ['cv_3a_3adnn_5fsuperres_1949',['dnn_superres',['https://docs.opencv.org/4.2.0/de/d9a/namespacecv_1_1dnn__superres.html',1,'cv']]], - ['cv_3a_3adpm_1950',['dpm',['https://docs.opencv.org/4.2.0/d5/d43/namespacecv_1_1dpm.html',1,'cv']]], - ['cv_3a_3adynafu_1951',['dynafu',['https://docs.opencv.org/4.2.0/d4/d41/namespacecv_1_1dynafu.html',1,'cv']]], - ['cv_3a_3aerror_1952',['Error',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html',1,'cv']]], - ['cv_3a_3aface_1953',['face',['https://docs.opencv.org/4.2.0/d4/d48/namespacecv_1_1face.html',1,'cv']]], - ['cv_3a_3aface_3a_3afacemarkaam_1954',['FacemarkAAM',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html',1,'cv::face']]], - ['cv_3a_3aface_3a_3afacemarklbf_1955',['FacemarkLBF',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1face_1_1FacemarkLBF_1_1BBox.html',1,'cv::face']]], - ['cv_3a_3aface_3a_3astandardcollector_1956',['StandardCollector',['https://docs.opencv.org/4.2.0/d2/d5a/structcv_1_1face_1_1StandardCollector_1_1PredictResult.html',1,'cv::face']]], - ['cv_3a_3afisheye_1957',['fisheye',['https://docs.opencv.org/4.2.0/d2/d14/namespacecv_1_1fisheye.html',1,'cv']]], - ['cv_3a_3aflann_1958',['flann',['https://docs.opencv.org/4.2.0/d0/d0a/namespacecv_1_1flann.html',1,'cv']]], - ['cv_3a_3afreetype_1959',['freetype',['https://docs.opencv.org/4.2.0/db/d33/namespacecv_1_1freetype.html',1,'cv']]], - ['cv_3a_3aft_1960',['ft',['https://docs.opencv.org/4.2.0/df/d47/namespacecv_1_1ft.html',1,'cv']]], - ['cv_3a_3agapi_1961',['gapi',['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html',1,'cv']]], - ['cv_3a_3agapi_3a_3acompound_1962',['compound',['https://docs.opencv.org/4.2.0/d8/d5c/namespacecv_1_1gapi_1_1compound.html',1,'cv::gapi']]], - ['cv_3a_3agapi_3a_3acore_1963',['core',['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html',1,'cv::gapi']]], - ['cv_3a_3agapi_3a_3acore_3a_3acpu_1964',['cpu',['https://docs.opencv.org/4.2.0/d6/dd0/namespacecv_1_1gapi_1_1core_1_1cpu.html',1,'cv::gapi::core']]], - ['cv_3a_3agapi_3a_3acore_3a_3afluid_1965',['fluid',['https://docs.opencv.org/4.2.0/db/db6/namespacecv_1_1gapi_1_1core_1_1fluid.html',1,'cv::gapi::core']]], - ['cv_3a_3agapi_3a_3acore_3a_3agpu_1966',['gpu',['https://docs.opencv.org/4.2.0/db/d86/namespacecv_1_1gapi_1_1core_1_1gpu.html',1,'cv::gapi::core']]], - ['cv_3a_3agapi_3a_3acore_3a_3aocl_1967',['ocl',['https://docs.opencv.org/4.2.0/d6/d68/namespacecv_1_1gapi_1_1core_1_1ocl.html',1,'cv::gapi::core']]], - ['cv_3a_3agapi_3a_3acore_3a_3aplaidml_1968',['plaidml',['https://docs.opencv.org/4.2.0/d1/d49/namespacecv_1_1gapi_1_1core_1_1plaidml.html',1,'cv::gapi::core']]], - ['cv_3a_3agapi_3a_3acpu_1969',['cpu',['https://docs.opencv.org/4.2.0/d0/d83/namespacecv_1_1gapi_1_1cpu.html',1,'cv::gapi']]], - ['cv_3a_3agapi_3a_3afluid_1970',['fluid',['https://docs.opencv.org/4.2.0/d0/d1a/namespacecv_1_1gapi_1_1fluid.html',1,'cv::gapi']]], - ['cv_3a_3agapi_3a_3afluid_3a_3aview_1971',['View',['https://docs.opencv.org/4.2.0/da/da5/structcv_1_1gapi_1_1fluid_1_1View_1_1Cache.html',1,'cv::gapi::fluid']]], - ['cv_3a_3agapi_3a_3aie_1972',['ie',['https://docs.opencv.org/4.2.0/d1/dae/namespacecv_1_1gapi_1_1ie.html',1,'cv::gapi']]], - ['cv_3a_3agapi_3a_3aie_3a_3adetail_1973',['detail',['https://docs.opencv.org/4.2.0/d5/dfc/namespacecv_1_1gapi_1_1ie_1_1detail.html',1,'cv::gapi::ie']]], - ['cv_3a_3agapi_3a_3aimgproc_1974',['imgproc',['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html',1,'cv::gapi']]], - ['cv_3a_3agapi_3a_3aimgproc_3a_3acpu_1975',['cpu',['https://docs.opencv.org/4.2.0/d3/dde/namespacecv_1_1gapi_1_1imgproc_1_1cpu.html',1,'cv::gapi::imgproc']]], - ['cv_3a_3agapi_3a_3aimgproc_3a_3afluid_1976',['fluid',['https://docs.opencv.org/4.2.0/d3/def/namespacecv_1_1gapi_1_1imgproc_1_1fluid.html',1,'cv::gapi::imgproc']]], - ['cv_3a_3agapi_3a_3aimgproc_3a_3agpu_1977',['gpu',['https://docs.opencv.org/4.2.0/df/d89/namespacecv_1_1gapi_1_1imgproc_1_1gpu.html',1,'cv::gapi::imgproc']]], - ['cv_3a_3agapi_3a_3aimgproc_3a_3aocl_1978',['ocl',['https://docs.opencv.org/4.2.0/dc/d7a/namespacecv_1_1gapi_1_1imgproc_1_1ocl.html',1,'cv::gapi::imgproc']]], - ['cv_3a_3agapi_3a_3aocl_1979',['ocl',['https://docs.opencv.org/4.2.0/d8/dc9/namespacecv_1_1gapi_1_1ocl.html',1,'cv::gapi']]], - ['cv_3a_3agapi_3a_3aown_1980',['own',['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html',1,'cv::gapi']]], - ['cv_3a_3agapi_3a_3aown_3a_3adetail_1981',['detail',['https://docs.opencv.org/4.2.0/d0/d06/namespacecv_1_1gapi_1_1own_1_1detail.html',1,'cv::gapi::own']]], - ['cv_3a_3agapi_3a_3aplaidml_1982',['plaidml',['https://docs.opencv.org/4.2.0/d6/dbb/namespacecv_1_1gapi_1_1plaidml.html',1,'cv::gapi']]], - ['cv_3a_3agapi_3a_3arender_1983',['render',['https://docs.opencv.org/4.2.0/db/df4/namespacecv_1_1gapi_1_1render.html',1,'cv::gapi']]], - ['cv_3a_3agapi_3a_3arender_3a_3aocv_1984',['ocv',['https://docs.opencv.org/4.2.0/da/d40/namespacecv_1_1gapi_1_1render_1_1ocv.html',1,'cv::gapi::render']]], - ['cv_3a_3agapi_3a_3awip_1985',['wip',['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html',1,'cv::gapi']]], - ['cv_3a_3agapi_3a_3awip_3a_3adraw_1986',['draw',['https://docs.opencv.org/4.2.0/df/d8d/namespacecv_1_1gapi_1_1wip_1_1draw.html',1,'cv::gapi::wip']]], - ['cv_3a_3agarray_1987',['GArray',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#a91e30185633cddc373a780afeb845c78',1,'cv::detail::GArrayU']]], - ['cv_3a_3agcomputationt_1988',['GComputationT',['https://docs.opencv.org/4.2.0/dd/d7b/classcv_1_1GComputationT_3_01R_07Args_8_8_8_08_4_1_1GCompiledT.html',1,'cv']]], - ['cv_3a_3agimpl_1989',['gimpl',['https://docs.opencv.org/4.2.0/d9/d43/namespacecv_1_1gimpl.html',1,'cv']]], - ['cv_3a_3agimpl_3a_3arender_1990',['render',['https://docs.opencv.org/4.2.0/d6/dc2/namespacecv_1_1gimpl_1_1render.html',1,'cv::gimpl']]], - ['cv_3a_3agimpl_3a_3arender_3a_3aocv_1991',['ocv',['https://docs.opencv.org/4.2.0/d8/d57/namespacecv_1_1gimpl_1_1render_1_1ocv.html',1,'cv::gimpl::render']]], - ['cv_3a_3ahal_1992',['hal',['https://docs.opencv.org/4.2.0/d6/d19/namespacecv_1_1hal.html',1,'cv']]], - ['cv_3a_3ahdf_1993',['hdf',['https://docs.opencv.org/4.2.0/dd/d44/namespacecv_1_1hdf.html',1,'cv']]], - ['cv_3a_3ahfs_1994',['hfs',['https://docs.opencv.org/4.2.0/d9/de8/namespacecv_1_1hfs.html',1,'cv']]], - ['cv_3a_3aimg_5fhash_1995',['img_hash',['https://docs.opencv.org/4.2.0/de/d85/namespacecv_1_1img__hash.html',1,'cv']]], - ['cv_3a_3ainstr_1996',['instr',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html',1,'cv']]], - ['cv_3a_3ainternal_1997',['internal',['https://docs.opencv.org/4.2.0/d4/d88/namespacecv_1_1internal.html',1,'cv']]], - ['cv_3a_3akinfu_1998',['kinfu',['https://docs.opencv.org/4.2.0/d9/dfc/namespacecv_1_1kinfu.html',1,'cv']]], - ['cv_3a_3aline_5fdescriptor_1999',['line_descriptor',['https://docs.opencv.org/4.2.0/d2/d51/namespacecv_1_1line__descriptor.html',1,'cv']]], - ['cv_3a_3alinemod_2000',['linemod',['https://docs.opencv.org/4.2.0/d5/d08/namespacecv_1_1linemod.html',1,'cv']]], - ['cv_3a_3alinemod_3a_3aquantizedpyramid_2001',['QuantizedPyramid',['https://docs.opencv.org/4.2.0/df/da3/structcv_1_1linemod_1_1QuantizedPyramid_1_1Candidate.html',1,'cv::linemod']]], - ['cv_3a_3almsolver_2002',['LMSolver',['https://docs.opencv.org/4.2.0/d8/d9f/classcv_1_1LMSolver_1_1Callback.html',1,'cv']]], - ['cv_3a_3aminproblemsolver_2003',['MinProblemSolver',['https://docs.opencv.org/4.2.0/da/d62/classcv_1_1MinProblemSolver_1_1Function.html',1,'cv']]], - ['cv_3a_3aml_2004',['ml',['https://docs.opencv.org/4.2.0/d8/df1/namespacecv_1_1ml.html',1,'cv']]], - ['cv_3a_3aml_3a_3asvm_2005',['SVM',['https://docs.opencv.org/4.2.0/d7/db8/classcv_1_1ml_1_1SVM_1_1Kernel.html',1,'cv::ml']]], - ['cv_3a_3amotempl_2006',['motempl',['https://docs.opencv.org/4.2.0/da/d2c/namespacecv_1_1motempl.html',1,'cv']]], - ['cv_3a_3amulticalib_2007',['multicalib',['https://docs.opencv.org/4.2.0/d8/db8/namespacecv_1_1multicalib.html',1,'cv']]], - ['cv_3a_3amulticalib_3a_3amulticameracalibration_2008',['MultiCameraCalibration',['https://docs.opencv.org/4.2.0/df/db0/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1edge.html',1,'cv::multicalib']]], - ['cv_3a_3aocl_2009',['ocl',['https://docs.opencv.org/4.2.0/d5/d96/namespacecv_1_1ocl.html',1,'cv']]], - ['cv_3a_3aogl_2010',['ogl',['https://docs.opencv.org/4.2.0/df/d60/namespacecv_1_1ogl.html',1,'cv']]], - ['cv_3a_3aogl_3a_3aocl_2011',['ocl',['https://docs.opencv.org/4.2.0/d1/d36/namespacecv_1_1ogl_1_1ocl.html',1,'cv::ogl']]], - ['cv_3a_3aomnidir_2012',['omnidir',['https://docs.opencv.org/4.2.0/db/dd2/namespacecv_1_1omnidir.html',1,'cv']]], - ['cv_3a_3aomnidir_3a_3ainternal_2013',['internal',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html',1,'cv::omnidir']]], - ['cv_3a_3aoptflow_2014',['optflow',['https://docs.opencv.org/4.2.0/d7/df9/namespacecv_1_1optflow.html',1,'cv']]], - ['cv_3a_3aovis_2015',['ovis',['https://docs.opencv.org/4.2.0/dc/d06/namespacecv_1_1ovis.html',1,'cv']]], - ['cv_3a_3aphase_5funwrapping_2016',['phase_unwrapping',['https://docs.opencv.org/4.2.0/dd/dea/namespacecv_1_1phase__unwrapping.html',1,'cv']]], - ['cv_3a_3aplot_2017',['plot',['https://docs.opencv.org/4.2.0/d0/d62/namespacecv_1_1plot.html',1,'cv']]], - ['cv_3a_3appf_5fmatch_5f3d_2018',['ppf_match_3d',['https://docs.opencv.org/4.2.0/d0/de6/namespacecv_1_1ppf__match__3d.html',1,'cv']]], - ['cv_3a_3aquality_2019',['quality',['https://docs.opencv.org/4.2.0/da/d0b/namespacecv_1_1quality.html',1,'cv']]], - ['cv_3a_3aquality_3a_3aquality_5futils_2020',['quality_utils',['https://docs.opencv.org/4.2.0/d6/d84/namespacecv_1_1quality_1_1quality__utils.html',1,'cv::quality']]], - ['cv_3a_3aquality_3a_3aqualitygmsd_2021',['QualityGMSD',['https://docs.opencv.org/4.2.0/d2/d60/structcv_1_1quality_1_1QualityGMSD_1_1__mat__data.html',1,'cv::quality']]], - ['cv_3a_3aquality_3a_3aqualityssim_2022',['QualitySSIM',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html',1,'cv::quality']]], - ['cv_3a_3arandpattern_2023',['randpattern',['https://docs.opencv.org/4.2.0/db/d7d/namespacecv_1_1randpattern.html',1,'cv']]], - ['cv_3a_3areg_2024',['reg',['https://docs.opencv.org/4.2.0/dd/d9a/namespacecv_1_1reg.html',1,'cv']]], - ['cv_3a_3argbd_2025',['rgbd',['https://docs.opencv.org/4.2.0/d7/d0b/namespacecv_1_1rgbd.html',1,'cv']]], - ['cv_3a_3asaliency_2026',['saliency',['https://docs.opencv.org/4.2.0/dc/d0d/namespacecv_1_1saliency.html',1,'cv']]], - ['cv_3a_3asamples_2027',['samples',['https://docs.opencv.org/4.2.0/df/df3/namespacecv_1_1samples.html',1,'cv']]], - ['cv_3a_3asfm_2028',['sfm',['https://docs.opencv.org/4.2.0/db/db0/namespacecv_1_1sfm.html',1,'cv']]], - ['cv_3a_3asimpleblobdetector_2029',['SimpleBlobDetector',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html',1,'cv']]], - ['cv_3a_3asparsemat_2030',['SparseMat',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html',1,'cv']]], - ['cv_3a_3astereo_2031',['stereo',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html',1,'cv']]], - ['cv_3a_3astructured_5flight_2032',['structured_light',['https://docs.opencv.org/4.2.0/d7/d58/namespacecv_1_1structured__light.html',1,'cv']]], - ['cv_3a_3astructured_5flight_3a_3asinusoidalpattern_2033',['SinusoidalPattern',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html',1,'cv::structured_light']]], - ['cv_3a_3asubdiv2d_2034',['Subdiv2D',['https://docs.opencv.org/4.2.0/d4/dbc/structcv_1_1Subdiv2D_1_1QuadEdge.html',1,'cv']]], - ['cv_3a_3asuperres_2035',['superres',['https://docs.opencv.org/4.2.0/d8/d85/namespacecv_1_1superres.html',1,'cv']]], - ['cv_3a_3atbm_2036',['tbm',['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html',1,'cv']]], - ['cv_3a_3atext_2037',['text',['https://docs.opencv.org/4.2.0/d8/de7/namespacecv_1_1text.html',1,'cv']]], - ['cv_3a_3atext_3a_3aerfilter_2038',['ERFilter',['https://docs.opencv.org/4.2.0/d0/d4f/classcv_1_1text_1_1ERFilter_1_1Callback.html',1,'cv::text']]], - ['cv_3a_3atext_3a_3aocrbeamsearchdecoder_2039',['OCRBeamSearchDecoder',['https://docs.opencv.org/4.2.0/de/d2d/classcv_1_1text_1_1OCRBeamSearchDecoder_1_1ClassifierCallback.html',1,'cv::text']]], - ['cv_3a_3atext_3a_3aocrhmmdecoder_2040',['OCRHMMDecoder',['https://docs.opencv.org/4.2.0/db/dc0/classcv_1_1text_1_1OCRHMMDecoder_1_1ClassifierCallback.html',1,'cv::text']]], - ['cv_3a_3atld_2041',['tld',['https://docs.opencv.org/4.2.0/db/d13/namespacecv_1_1tld.html',1,'cv']]], - ['cv_3a_3atrackerboosting_2042',['TrackerBoosting',['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html',1,'cv']]], - ['cv_3a_3atrackercsrt_2043',['TrackerCSRT',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html',1,'cv']]], - ['cv_3a_3atrackerfeaturehaar_2044',['TrackerFeatureHAAR',['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html',1,'cv']]], - ['cv_3a_3atrackergoturn_2045',['TrackerGOTURN',['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1TrackerGOTURN_1_1Params.html',1,'cv']]], - ['cv_3a_3atrackerkcf_2046',['TrackerKCF',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html',1,'cv']]], - ['cv_3a_3atrackermedianflow_2047',['TrackerMedianFlow',['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html',1,'cv']]], - ['cv_3a_3atrackermil_2048',['TrackerMIL',['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html',1,'cv']]], - ['cv_3a_3atrackersamplercs_2049',['TrackerSamplerCS',['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html',1,'cv']]], - ['cv_3a_3atrackersamplercsc_2050',['TrackerSamplerCSC',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html',1,'cv']]], - ['cv_3a_3atrackersamplerpf_2051',['TrackerSamplerPF',['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html',1,'cv']]], - ['cv_3a_3atrackerstateestimatoradaboosting_2052',['TrackerStateEstimatorAdaBoosting',['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html',1,'cv']]], - ['cv_3a_3atrackerstateestimatormilboosting_2053',['TrackerStateEstimatorMILBoosting',['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html',1,'cv']]], - ['cv_3a_3atrackertld_2054',['TrackerTLD',['https://docs.opencv.org/4.2.0/d3/dd0/structcv_1_1TrackerTLD_1_1Params.html',1,'cv']]], - ['cv_3a_3atracking_2055',['tracking',['https://docs.opencv.org/4.2.0/da/dd0/namespacecv_1_1tracking.html',1,'cv']]], - ['cv_3a_3atraits_2056',['traits',['https://docs.opencv.org/4.2.0/d7/db8/namespacecv_1_1traits.html',1,'cv']]], - ['cv_3a_3autil_2057',['util',['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html',1,'cv']]], - ['cv_3a_3autil_3a_3adetail_2058',['detail',['https://docs.opencv.org/4.2.0/d9/dab/namespacecv_1_1util_1_1detail.html',1,'cv::util']]], - ['cv_3a_3autils_2059',['utils',['https://docs.opencv.org/4.2.0/d3/dc4/namespacecv_1_1utils.html',1,'cv']]], - ['cv_3a_3autils_3a_3afs_2060',['fs',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html',1,'cv::utils']]], - ['cv_3a_3autils_3a_3alogging_2061',['logging',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html',1,'cv::utils']]], - ['cv_3a_3autils_3a_3alogging_3a_3ainternal_2062',['internal',['https://docs.opencv.org/4.2.0/d9/dd4/namespacecv_1_1utils_1_1logging_1_1internal.html',1,'cv::utils::logging']]], - ['cv_3a_3autils_3a_3atrace_2063',['trace',['https://docs.opencv.org/4.2.0/d1/d07/namespacecv_1_1utils_1_1trace.html',1,'cv::utils']]], - ['cv_3a_3ava_5fintel_2064',['va_intel',['https://docs.opencv.org/4.2.0/d9/d83/namespacecv_1_1va__intel.html',1,'cv']]], - ['cv_3a_3ava_5fintel_3a_3aocl_2065',['ocl',['https://docs.opencv.org/4.2.0/df/df8/namespacecv_1_1va__intel_1_1ocl.html',1,'cv::va_intel']]], - ['cv_3a_3avideoio_5fregistry_2066',['videoio_registry',['https://docs.opencv.org/4.2.0/de/dde/namespacecv_1_1videoio__registry.html',1,'cv']]], - ['cv_3a_3avideostab_2067',['videostab',['https://docs.opencv.org/4.2.0/da/d6d/namespacecv_1_1videostab.html',1,'cv']]], - ['cv_3a_3aviz_2068',['viz',['https://docs.opencv.org/4.2.0/d9/d62/namespacecv_1_1viz.html',1,'cv']]], - ['cv_3a_3axfeatures2d_2069',['xfeatures2d',['https://docs.opencv.org/4.2.0/d3/df6/namespacecv_1_1xfeatures2d.html',1,'cv']]], - ['cv_3a_3aximgproc_2070',['ximgproc',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html',1,'cv']]], - ['cv_3a_3aximgproc_3a_3arl_2071',['rl',['https://docs.opencv.org/4.2.0/d2/d1a/namespacecv_1_1ximgproc_1_1rl.html',1,'cv::ximgproc']]], - ['cv_3a_3aximgproc_3a_3asegmentation_2072',['segmentation',['https://docs.opencv.org/4.2.0/d8/d8a/namespacecv_1_1ximgproc_1_1segmentation.html',1,'cv::ximgproc']]], - ['cv_3a_3axobjdetect_2073',['xobjdetect',['https://docs.opencv.org/4.2.0/d3/d30/namespacecv_1_1xobjdetect.html',1,'cv']]], - ['cv_3a_3axphoto_2074',['xphoto',['https://docs.opencv.org/4.2.0/df/db9/namespacecv_1_1xphoto.html',1,'cv']]], - ['cv_5fabs_2075',['cv_abs',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gab3fbec499b8b9ec34ebbc038aa0df479',1,'cv::cv_abs(_Tp x)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga7ff9da9e1d83d45c8778435633074fd7',1,'cv::cv_abs(uchar x)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga39fbc1a33aedb130e3c0e59e8c2f64ec',1,'cv::cv_abs(schar x)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga276f90264ac8083f22d139520f62c44f',1,'cv::cv_abs(ushort x)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga4f5a784b6921093228ec0ffd3b464fa5',1,'cv::cv_abs(short x)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gab3fbec499b8b9ec34ebbc038aa0df479',1,'cv_abs(_Tp x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga7ff9da9e1d83d45c8778435633074fd7',1,'cv_abs(uchar x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga39fbc1a33aedb130e3c0e59e8c2f64ec',1,'cv_abs(schar x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga276f90264ac8083f22d139520f62c44f',1,'cv_abs(ushort x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga4f5a784b6921093228ec0ffd3b464fa5',1,'cv_abs(short x)(Global Namespace)']]], - ['cv_5fcpu_5fdispatch_2eh_2076',['cv_cpu_dispatch.h',['https://docs.opencv.org/4.2.0/d1/dac/cv__cpu__dispatch_8h.html',1,'']]], - ['cv_5fcpu_5fhelper_2eh_2077',['cv_cpu_helper.h',['https://docs.opencv.org/4.2.0/d2/d3b/cv__cpu__helper_8h.html',1,'']]], - ['cv_5fcpu_5finclude_5fsimd_5fdeclarations_2ehpp_2078',['cv_cpu_include_simd_declarations.hpp',['https://docs.opencv.org/4.2.0/d2/d7c/cv__cpu__include__simd__declarations_8hpp.html',1,'']]], - ['cv_5fcs_5fcensus_2079',['CV_CS_CENSUS',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030aac1c7a2d4ad6f2a23a39bf8b760c00a7',1,'cv::stereo']]], - ['cv_5fdense_5fcensus_2080',['CV_DENSE_CENSUS',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030afd8fa32e4653c225c061fb2326b2eba0',1,'cv::stereo']]], - ['cv_5ferror_5ffail_2081',['CV_ERROR_FAIL',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html#gga3fa591dc2d89e8e6b84a2a7202e53367ac34ec3b7a47b8f639326d44d5074c6ef',1,]]], - ['cv_5ferror_5fok_2082',['CV_ERROR_OK',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html#gga3fa591dc2d89e8e6b84a2a7202e53367abf35bd19393375fdeeef47ae6cfde0f8',1,]]], - ['cv_5fmean_5fvariation_2083',['CV_MEAN_VARIATION',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030a0103fea918b22dd6e8882c5b06043d7e',1,'cv::stereo']]], - ['cv_5fmodified_5fcensus_5ftransform_2084',['CV_MODIFIED_CENSUS_TRANSFORM',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030a1bde9860c3201024e7b68e5dc71931c5',1,'cv::stereo']]], - ['cv_5fmodified_5fcs_5fcensus_2085',['CV_MODIFIED_CS_CENSUS',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030aa217c4ece909e8d27bdcb50a12d81f6d',1,'cv::stereo']]], - ['cv_5fquadratic_5finterpolation_2086',['CV_QUADRATIC_INTERPOLATION',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gga0316af1df7908b2fb741f282dcb2ae74a9b1155a0c2c6722aa9e41c4c4d4c0a58',1,'cv::stereo::CV_QUADRATIC_INTERPOLATION'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gga0316af1df7908b2fb741f282dcb2ae74a9b1155a0c2c6722aa9e41c4c4d4c0a58',1,'CV_QUADRATIC_INTERPOLATION(Global Namespace)']]], - ['cv_5fsimetricv_5finterpolation_2087',['CV_SIMETRICV_INTERPOLATION',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gga0316af1df7908b2fb741f282dcb2ae74a44f645f3eb948edfd55a5c9bb73dbd82',1,'cv::stereo::CV_SIMETRICV_INTERPOLATION'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gga0316af1df7908b2fb741f282dcb2ae74a44f645f3eb948edfd55a5c9bb73dbd82',1,'CV_SIMETRICV_INTERPOLATION(Global Namespace)']]], - ['cv_5fsparse_5fcensus_2088',['CV_SPARSE_CENSUS',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030ac08eff59ba7cfc0aa727e62530b32223',1,'cv::stereo']]], - ['cv_5fspeckle_5fremoval_5falgorithm_2089',['CV_SPECKLE_REMOVAL_ALGORITHM',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ggae93f4ada32b12123aeed26cb01094638ad3a671c26e45b96aca07a4562d9b9db7',1,'cv::stereo::CV_SPECKLE_REMOVAL_ALGORITHM'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ggae93f4ada32b12123aeed26cb01094638ad3a671c26e45b96aca07a4562d9b9db7',1,'CV_SPECKLE_REMOVAL_ALGORITHM(Global Namespace)']]], - ['cv_5fspeckle_5fremoval_5favg_5falgorithm_2090',['CV_SPECKLE_REMOVAL_AVG_ALGORITHM',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ggae93f4ada32b12123aeed26cb01094638ad2b1bbe8c716a18472feab8784695f5d',1,'cv::stereo::CV_SPECKLE_REMOVAL_AVG_ALGORITHM'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ggae93f4ada32b12123aeed26cb01094638ad2b1bbe8c716a18472feab8784695f5d',1,'CV_SPECKLE_REMOVAL_AVG_ALGORITHM(Global Namespace)']]], - ['cv_5fstar_5fkernel_2091',['CV_STAR_KERNEL',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030af1709c357cf1ba90ad602dde3cab283f',1,'cv::stereo']]], - ['cv_5fstatus_2092',['cv_status',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html#gad3ce465ffb10e354aa30c4ce93b68bee',1,'std::cv_status'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html#gad3ce465ffb10e354aa30c4ce93b68bee',1,'cv_status(Global Namespace)']]], - ['cv_5funused_2093',['CV_UNUSED',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#abfb11f5348247bc930a7ffb953efd166',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#ac6894b0fbbc7cbae1e389b33ff0dbf5a',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#ab1dc3eb6286fb5d7874773b6a36cbf89',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#aa48d9c37039275f85a9bcecfc4601e6f',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a364cccdc091b79979398213a1faef497',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#aa2bcefca61d98059885b95473b631112',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a4b84f8dd9fea5a8080efc43f1d623b12',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a793ec34ffabea9a55d7136a6110589dd',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a2edc3d0452446a9264ce5d2389bbaeff',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a6d17c677ce74defaf3de65fe021f7cbd',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a670bce50efd81aa557ddcde80d71dbb1',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#ab13211abaaa4aaab2fcbd584d4be9fc6',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d4/d1d/interfaceCvPhotoCamera.html#a88ca069176e27ed45ed33738a0316477',1,'CvPhotoCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#aba3829a775c6f93feae0f589fa1f948c',1,'CvVideoCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#aa7f4cb9d0289b6973e0666fd038cade2',1,'CvVideoCamera::CV_UNUSED()']]], - ['cv_5fvrecp_5ff32_2094',['cv_vrecp_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#gaeb314eb0f269a9769453517e931e3963',1,]]], - ['cv_5fvrecpq_5ff32_2095',['cv_vrecpq_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#ga2c5d24998fb8d4d09587ae59276ccc7b',1,]]], - ['cv_5fvrnd_5fs32_5ff32_2096',['cv_vrnd_s32_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#ga8a5239a569a5981ebde879d4733880a7',1,]]], - ['cv_5fvrnd_5fu32_5ff32_2097',['cv_vrnd_u32_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#gafdc59151bc3772ea9ba541aac20c9475',1,]]], - ['cv_5fvrndq_5fs32_5ff32_2098',['cv_vrndq_s32_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#ga048ba8911b40c0a93c66b181d93ffd21',1,]]], - ['cv_5fvrndq_5fu32_5ff32_2099',['cv_vrndq_u32_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#gad1de174f2f34485c51599e29a6c6ffa2',1,]]], - ['cv_5fvrsqrt_5ff32_2100',['cv_vrsqrt_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#ga9630868e44d91def9c50ad17d89931c3',1,]]], - ['cv_5fvrsqrtq_5ff32_2101',['cv_vrsqrtq_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#ga7971ec21fe2577b92fe9da005a981fb4',1,]]], - ['cv_5fvsqrt_5ff32_2102',['cv_vsqrt_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#gacb20dd29e179b19bf38293670d522fc8',1,]]], - ['cv_5fvsqrtq_5ff32_2103',['cv_vsqrtq_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#ga912f76560209db18ef4afb1d73bdd472',1,]]], - ['cvabstractcamera_2104',['CvAbstractCamera',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html',1,'']]], - ['cvceil_2105',['cvCeil',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga2938a33996791626f9f122e054ed34c4',1,'cvCeil(double value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga859c43a2bc10d1bc89a9a538ec41dc80',1,'cvCeil(float value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf724f15663be3c0130026d0eab7fc5ae',1,'cvCeil(int value)(Global Namespace)']]], - ['cvdef_2eh_2106',['cvdef.h',['https://docs.opencv.org/4.2.0/dc/dcc/cvdef_8h.html',1,'']]], - ['cvdefs_2ehpp_2107',['cvdefs.hpp',['https://docs.opencv.org/4.2.0/df/da4/cvdefs_8hpp.html',1,'']]], - ['cvfeatureevaluator_2108',['CvFeatureEvaluator',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html',1,'cv']]], - ['cvfeatureparams_2109',['CvFeatureParams',['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html',1,'cv::CvFeatureParams'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#a12ddfe0612d04238b6df541e8ab27e19',1,'cv::CvFeatureParams::CvFeatureParams()']]], - ['cvflann_2110',['cvflann',['https://docs.opencv.org/4.2.0/dc/d8c/namespacecvflann.html',1,'']]], - ['cvfloor_2111',['cvFloor',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga1c4500a953c96901f87178f098c781af',1,'cvFloor(double value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gab482bef3966b6f9641d1995c3c05b160',1,'cvFloor(float value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaff8dcaaf14e156f04f42e79a3db5956e',1,'cvFloor(int value)(Global Namespace)']]], - ['cvhaarevaluator_2112',['CvHaarEvaluator',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html',1,'cv']]], - ['cvhaarfeatureparams_2113',['CvHaarFeatureParams',['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html',1,'cv::CvHaarFeatureParams'],['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#a3a721c14f37d0b5203059dc708d79ef9',1,'cv::CvHaarFeatureParams::CvHaarFeatureParams()']]], - ['cvhaldft_2114',['cvhalDFT',['https://docs.opencv.org/4.2.0/de/d27/structcvhalDFT.html',1,'']]], - ['cvhalfilter2d_2115',['cvhalFilter2D',['https://docs.opencv.org/4.2.0/d2/da8/structcvhalFilter2D.html',1,'']]], - ['cvhalkeypoint_2116',['cvhalKeyPoint',['https://docs.opencv.org/4.2.0/d9/daa/structcvhalKeyPoint.html',1,'']]], - ['cvhogevaluator_2117',['CvHOGEvaluator',['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html',1,'cv']]], - ['cvhogfeatureparams_2118',['CvHOGFeatureParams',['https://docs.opencv.org/4.2.0/d4/d4a/structcv_1_1CvHOGFeatureParams.html',1,'cv::CvHOGFeatureParams'],['https://docs.opencv.org/4.2.0/d4/d4a/structcv_1_1CvHOGFeatureParams.html#a64beaa2d7c1d4f5191f8f5730587394e',1,'cv::CvHOGFeatureParams::CvHOGFeatureParams()']]], - ['cvisinf_2119',['cvIsInf',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae04046b1211c77ff19a535bd78c15964',1,'cvIsInf(double value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gafe19ff681b44d364c0e1991d138d680c',1,'cvIsInf(float value)(Global Namespace)']]], - ['cvisnan_2120',['cvIsNaN',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae41ccc6a43a73d4d8e79794c8c544407',1,'cvIsNaN(double value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga572cd5c424274efedf0d43b3484e2ee5',1,'cvIsNaN(float value)(Global Namespace)']]], - ['cvlbpevaluator_2121',['CvLBPEvaluator',['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html',1,'cv']]], - ['cvlbpfeatureparams_2122',['CvLBPFeatureParams',['https://docs.opencv.org/4.2.0/d2/d3c/structcv_1_1CvLBPFeatureParams.html',1,'cv::CvLBPFeatureParams'],['https://docs.opencv.org/4.2.0/d2/d3c/structcv_1_1CvLBPFeatureParams.html#a5f152a53a75178ec96997bcd14d4e7e4',1,'cv::CvLBPFeatureParams::CvLBPFeatureParams()']]], - ['cvparams_2123',['CvParams',['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html',1,'cv::CvParams'],['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html#a4ed70ff2fa4e0a3f12f93df192ef509e',1,'cv::CvParams::CvParams()']]], - ['cvphotocamera_2124',['CvPhotoCamera',['https://docs.opencv.org/4.2.0/d4/d1d/interfaceCvPhotoCamera.html',1,'']]], - ['cvphotocameradelegate_20_2dp_2dp_2125',['CvPhotoCameraDelegate -p-p',['https://docs.opencv.org/4.2.0/d7/d2f/protocolCvPhotoCameraDelegate_01-p.html',1,'']]], - ['cvresult_2126',['CvResult',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html#ga3fa591dc2d89e8e6b84a2a7202e53367',1,]]], - ['cvround_2127',['cvRound',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga085eca238176984a0b72df2818598d85',1,'cvRound(double value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga977608301213682f12e68dcf1f77c288',1,'cvRound(float value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga47ead185bfeefb70d09e90d8fe8afde7',1,'cvRound(int value)(Global Namespace)']]], - ['cvstd_2ehpp_2128',['cvstd.hpp',['https://docs.opencv.org/4.2.0/dd/dc7/cvstd_8hpp.html',1,'']]], - ['cvstd_5fwrapper_2ehpp_2129',['cvstd_wrapper.hpp',['https://docs.opencv.org/4.2.0/d7/d47/cvstd__wrapper_8hpp.html',1,'']]], - ['cvt16f32f_2130',['cvt16f32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga90843d0e83d8c1f2bb491d3fe4e45639',1,'cv::hal::cvt16f32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga90843d0e83d8c1f2bb491d3fe4e45639',1,'cvt16f32f()(Global Namespace)']]], - ['cvt32f16f_2131',['cvt32f16f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38a28588accd8729825383f8e8848b9b',1,'cv::hal::cvt32f16f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38a28588accd8729825383f8e8848b9b',1,'cvt32f16f()(Global Namespace)']]], - ['cvt_5f_2132',['cvt_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36e3f3093575c9485606ee7f43945ea5',1,'cv::cudev::cvt_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36e3f3093575c9485606ee7f43945ea5',1,'cvt_()(Global Namespace)']]], - ['cvtbgr5x5tobgr_2133',['cvtBGR5x5toBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga6a5412fa603b31e2ab13ee50272e1d25',1,'cv::hal::cvtBGR5x5toBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga6a5412fa603b31e2ab13ee50272e1d25',1,'cvtBGR5x5toBGR()(Global Namespace)']]], - ['cvtbgr5x5togray_2134',['cvtBGR5x5toGray',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga613ae5d9e9aaaec3e8b11f060d7c84df',1,'cv::hal::cvtBGR5x5toGray()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga613ae5d9e9aaaec3e8b11f060d7c84df',1,'cvtBGR5x5toGray()(Global Namespace)']]], - ['cvtbgrtobgr_2135',['cvtBGRtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga93098228063985aa2bababe21f76e8bf',1,'cv::hal::cvtBGRtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga93098228063985aa2bababe21f76e8bf',1,'cvtBGRtoBGR()(Global Namespace)']]], - ['cvtbgrtobgr5x5_2136',['cvtBGRtoBGR5x5',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gab0ee904b73ac326cd6a43a9d6d3fa319',1,'cv::hal::cvtBGRtoBGR5x5()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gab0ee904b73ac326cd6a43a9d6d3fa319',1,'cvtBGRtoBGR5x5()(Global Namespace)']]], - ['cvtbgrtogray_2137',['cvtBGRtoGray',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga6cec65e9e9aa10cd364c2f558c34e808',1,'cv::hal::cvtBGRtoGray()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga6cec65e9e9aa10cd364c2f558c34e808',1,'cvtBGRtoGray()(Global Namespace)']]], - ['cvtbgrtohsv_2138',['cvtBGRtoHSV',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gafcf8f9a5fdc881a7acafc4f73eac06c7',1,'cv::hal::cvtBGRtoHSV()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gafcf8f9a5fdc881a7acafc4f73eac06c7',1,'cvtBGRtoHSV()(Global Namespace)']]], - ['cvtbgrtolab_2139',['cvtBGRtoLab',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga8cb363c62e2247a765fa38febaa8bc37',1,'cv::hal::cvtBGRtoLab()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga8cb363c62e2247a765fa38febaa8bc37',1,'cvtBGRtoLab()(Global Namespace)']]], - ['cvtbgrtothreeplaneyuv_2140',['cvtBGRtoThreePlaneYUV',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga4ba4f7bf73988e836d18ee61e76f9019',1,'cv::hal::cvtBGRtoThreePlaneYUV()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga4ba4f7bf73988e836d18ee61e76f9019',1,'cvtBGRtoThreePlaneYUV()(Global Namespace)']]], - ['cvtbgrtotwoplaneyuv_2141',['cvtBGRtoTwoPlaneYUV',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga1d485a19d2d1f427cada0288c468b5d0',1,'cv::hal::cvtBGRtoTwoPlaneYUV()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga1d485a19d2d1f427cada0288c468b5d0',1,'cvtBGRtoTwoPlaneYUV()(Global Namespace)']]], - ['cvtbgrtoxyz_2142',['cvtBGRtoXYZ',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga5342b7dbea365565170e30de4cf13647',1,'cv::hal::cvtBGRtoXYZ()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga5342b7dbea365565170e30de4cf13647',1,'cvtBGRtoXYZ()(Global Namespace)']]], - ['cvtbgrtoyuv_2143',['cvtBGRtoYUV',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga8e17075eb6abf950d2aab9bf9b4ed66d',1,'cv::hal::cvtBGRtoYUV()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga8e17075eb6abf950d2aab9bf9b4ed66d',1,'cvtBGRtoYUV()(Global Namespace)']]], - ['cvtcolor_2144',['cvtColor',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga397ae87e1288a81d2363b61574eb8cab',1,'cv::cvtColor()'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga48d0f208181d5ca370d8ff6b62cbe826',1,'cv::cuda::cvtColor()'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga397ae87e1288a81d2363b61574eb8cab',1,'cvtColor(InputArray src, OutputArray dst, int code, int dstCn=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga48d0f208181d5ca370d8ff6b62cbe826',1,'cvtColor(InputArray src, OutputArray dst, int code, int dcn=0, Stream &stream=Stream::Null())(Global Namespace)']]], - ['cvtcolortwoplane_2145',['cvtColorTwoPlane',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga8e873314e72a1a6c0252375538fbf753',1,'cv::cvtColorTwoPlane()'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga8e873314e72a1a6c0252375538fbf753',1,'cvtColorTwoPlane()(Global Namespace)']]], - ['cvtgraytobgr_2146',['cvtGraytoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga843c86dcf81c9cb6e6e0dc97952fe5d6',1,'cv::hal::cvtGraytoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga843c86dcf81c9cb6e6e0dc97952fe5d6',1,'cvtGraytoBGR()(Global Namespace)']]], - ['cvtgraytobgr5x5_2147',['cvtGraytoBGR5x5',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga6753adfed75b0adff0a2938a66c4df64',1,'cv::hal::cvtGraytoBGR5x5()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga6753adfed75b0adff0a2938a66c4df64',1,'cvtGraytoBGR5x5()(Global Namespace)']]], - ['cvthsvtobgr_2148',['cvtHSVtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gad00ad9bfcfa57596b81d16437f59aaba',1,'cv::hal::cvtHSVtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gad00ad9bfcfa57596b81d16437f59aaba',1,'cvtHSVtoBGR()(Global Namespace)']]], - ['cvtlabtobgr_2149',['cvtLabtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gab726ed6f0db14eafb657c1644474e7d4',1,'cv::hal::cvtLabtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gab726ed6f0db14eafb657c1644474e7d4',1,'cvtLabtoBGR()(Global Namespace)']]], - ['cvtmultipliedrgbatorgba_2150',['cvtMultipliedRGBAtoRGBA',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga249d8bbee8894e169c31b97e2ff75482',1,'cv::hal::cvtMultipliedRGBAtoRGBA()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga249d8bbee8894e169c31b97e2ff75482',1,'cvtMultipliedRGBAtoRGBA()(Global Namespace)']]], - ['cvtoneplaneyuvtobgr_2151',['cvtOnePlaneYUVtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga653c2a33761f5fa7de5e1d4acf8f0325',1,'cv::hal::cvtOnePlaneYUVtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga653c2a33761f5fa7de5e1d4acf8f0325',1,'cvtOnePlaneYUVtoBGR()(Global Namespace)']]], - ['cvtrgbatomultipliedrgba_2152',['cvtRGBAtoMultipliedRGBA',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gaceacd38bef5fee2d702af596a55fa97c',1,'cv::hal::cvtRGBAtoMultipliedRGBA()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gaceacd38bef5fee2d702af596a55fa97c',1,'cvtRGBAtoMultipliedRGBA()(Global Namespace)']]], - ['cvtthreeplaneyuvtobgr_2153',['cvtThreePlaneYUVtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gad66992caf43d79b68182b8192f093d3e',1,'cv::hal::cvtThreePlaneYUVtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gad66992caf43d79b68182b8192f093d3e',1,'cvtThreePlaneYUVtoBGR()(Global Namespace)']]], - ['cvttwoplaneyuvtobgr_2154',['cvtTwoPlaneYUVtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gab88de89b3d5fdf9b3d543a276d8b6f3e',1,'cv::hal::cvtTwoPlaneYUVtoBGR(const uchar *src_data, size_t src_step, uchar *dst_data, size_t dst_step, int dst_width, int dst_height, int dcn, bool swapBlue, int uIdx)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gac266a4ea6caa84aedd1545ead54f48c8',1,'cv::hal::cvtTwoPlaneYUVtoBGR(const uchar *y_data, const uchar *uv_data, size_t src_step, uchar *dst_data, size_t dst_step, int dst_width, int dst_height, int dcn, bool swapBlue, int uIdx)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gab88de89b3d5fdf9b3d543a276d8b6f3e',1,'cvtTwoPlaneYUVtoBGR(const uchar *src_data, size_t src_step, uchar *dst_data, size_t dst_step, int dst_width, int dst_height, int dcn, bool swapBlue, int uIdx)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gac266a4ea6caa84aedd1545ead54f48c8',1,'cvtTwoPlaneYUVtoBGR(const uchar *y_data, const uchar *uv_data, size_t src_step, uchar *dst_data, size_t dst_step, int dst_width, int dst_height, int dcn, bool swapBlue, int uIdx)(Global Namespace)']]], - ['cvtxyztobgr_2155',['cvtXYZtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gaa7a1b7cf283b8b67864de33e4e837d6d',1,'cv::hal::cvtXYZtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gaa7a1b7cf283b8b67864de33e4e837d6d',1,'cvtXYZtoBGR()(Global Namespace)']]], - ['cvtype_2156',['CvType',['https://docs.opencv.org/4.2.0/d1/def/structcv_1_1flann_1_1CvType.html',1,'cv::flann']]], - ['cvtype_3c_20char_20_3e_2157',['CvType< char >',['https://docs.opencv.org/4.2.0/dc/d89/structcv_1_1flann_1_1CvType_3_01char_01_4.html',1,'cv::flann']]], - ['cvtype_3c_20double_20_3e_2158',['CvType< double >',['https://docs.opencv.org/4.2.0/dc/d69/structcv_1_1flann_1_1CvType_3_01double_01_4.html',1,'cv::flann']]], - ['cvtype_3c_20float_20_3e_2159',['CvType< float >',['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1flann_1_1CvType_3_01float_01_4.html',1,'cv::flann']]], - ['cvtype_3c_20short_20_3e_2160',['CvType< short >',['https://docs.opencv.org/4.2.0/d2/def/structcv_1_1flann_1_1CvType_3_01short_01_4.html',1,'cv::flann']]], - ['cvtype_3c_20unsigned_20char_20_3e_2161',['CvType< unsigned char >',['https://docs.opencv.org/4.2.0/d7/da5/structcv_1_1flann_1_1CvType_3_01unsigned_01char_01_4.html',1,'cv::flann']]], - ['cvtype_3c_20unsigned_20short_20_3e_2162',['CvType< unsigned short >',['https://docs.opencv.org/4.2.0/d9/d57/structcv_1_1flann_1_1CvType_3_01unsigned_01short_01_4.html',1,'cv::flann']]], - ['cvtyuvtobgr_2163',['cvtYUVtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gae2655422efaaa35ad72b5f0af0b3d5dc',1,'cv::hal::cvtYUVtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gae2655422efaaa35ad72b5f0af0b3d5dc',1,'cvtYUVtoBGR(const uchar *src_data, size_t src_step, uchar *dst_data, size_t dst_step, int width, int height, int depth, int dcn, bool swapBlue, bool isCbCr)(Global Namespace)']]], - ['cvv_2164',['cvv',['https://docs.opencv.org/4.2.0/dd/d06/namespacecvv.html',1,'']]], - ['cvv_2ehpp_2165',['cvv.hpp',['https://docs.opencv.org/4.2.0/d2/dcf/cvv_2cvv_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d7f/cvv_8hpp.html',1,'(Global Namespace)']]], - ['cvv_3a_3aimpl_2166',['impl',['https://docs.opencv.org/4.2.0/d7/d84/namespacecvv_1_1impl.html',1,'cvv']]], - ['cvvideocamera_2167',['CvVideoCamera',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html',1,'']]], - ['cvvideocameradelegate_20_2dp_2dp_2168',['CvVideoCameraDelegate -p-p',['https://docs.opencv.org/4.2.0/d3/d54/protocolCvVideoCameraDelegate_01-p.html',1,'']]], - ['cwchar_2169',['cwchar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00254.html',1,'']]], - ['cwctype_2170',['cwctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00260.html',1,'']]], - ['cwisebinaryop_2171',['CwiseBinaryOp',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseBinaryOp.html',1,'Eigen']]], - ['cwisenullaryop_2172',['CwiseNullaryOp',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseNullaryOp.html',1,'Eigen']]], - ['cwiseternaryop_2173',['CwiseTernaryOp',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseTernaryOp.html',1,'Eigen']]], - ['cwiseunaryop_2174',['CwiseUnaryOp',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseUnaryOp.html',1,'Eigen']]], - ['cwiseunaryview_2175',['CwiseUnaryView',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseUnaryView.html',1,'Eigen']]], - ['cxxabi_2eh_2176',['cxxabi.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00023.html',1,'']]], - ['cxxabi_5fforced_2eh_2177',['cxxabi_forced.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00314.html',1,'']]], - ['cxxabi_5finit_5fexception_2eh_2178',['cxxabi_init_exception.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00317.html',1,'']]], - ['cxxabi_5ftweaks_2eh_2179',['cxxabi_tweaks.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00686.html',1,'']]], - ['cyan_2180',['cyan',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#acf7eaff21cdb5271925b5c326b9a1919',1,'cv::viz::Color']]], - ['cyl_5fbessel_5fi_2181',['cyl_bessel_i',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1c9b5a5c36f000a4f0a55f7fcc486cb0',1,'std::cyl_bessel_i()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga07dddd9af049c8700682f9de63f49430',1,'std::tr1::cyl_bessel_i()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1c9b5a5c36f000a4f0a55f7fcc486cb0',1,'cyl_bessel_i(_Tpnu __nu, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga07dddd9af049c8700682f9de63f49430',1,'cyl_bessel_i(_Tpnu __nu, _Tp __x)(Global Namespace)']]], - ['cyl_5fbessel_5fif_2182',['cyl_bessel_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaaf738427d4da0bda66bc2274dfb853a7',1,'std::cyl_bessel_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaaf738427d4da0bda66bc2274dfb853a7',1,'cyl_bessel_if()(Global Namespace)']]], - ['cyl_5fbessel_5fil_2183',['cyl_bessel_il',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gab7962629216d03efb8ecaa3f70c6878f',1,'std::cyl_bessel_il()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gab7962629216d03efb8ecaa3f70c6878f',1,'cyl_bessel_il()(Global Namespace)']]], - ['cyl_5fbessel_5fj_2184',['cyl_bessel_j',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga47e21a13b6d68d0d7f057699bd3b3ce0',1,'std::cyl_bessel_j()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga9f8aeb36e3e3ee1f6e15d597a46d772b',1,'std::tr1::cyl_bessel_j()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga47e21a13b6d68d0d7f057699bd3b3ce0',1,'cyl_bessel_j(_Tpnu __nu, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga9f8aeb36e3e3ee1f6e15d597a46d772b',1,'cyl_bessel_j(_Tpnu __nu, _Tp __x)(Global Namespace)']]], - ['cyl_5fbessel_5fjf_2185',['cyl_bessel_jf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga15731a7bccd6351d28353e3c4c2a2d23',1,'std::cyl_bessel_jf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga15731a7bccd6351d28353e3c4c2a2d23',1,'cyl_bessel_jf()(Global Namespace)']]], - ['cyl_5fbessel_5fjl_2186',['cyl_bessel_jl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gade8e94a80520a8b628b2d658755b25c0',1,'std::cyl_bessel_jl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gade8e94a80520a8b628b2d658755b25c0',1,'cyl_bessel_jl()(Global Namespace)']]], - ['cyl_5fbessel_5fk_2187',['cyl_bessel_k',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga76dcd3884620955680112aca0d327ada',1,'std::cyl_bessel_k()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga77fcb104653b63975ae800e48fb72ed0',1,'std::tr1::cyl_bessel_k()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga76dcd3884620955680112aca0d327ada',1,'cyl_bessel_k(_Tpnu __nu, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga77fcb104653b63975ae800e48fb72ed0',1,'cyl_bessel_k(_Tpnu __nu, _Tp __x)(Global Namespace)']]], - ['cyl_5fbessel_5fkf_2188',['cyl_bessel_kf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1f50047f9aab0ec8b1a1615fe9fbe32f',1,'std::cyl_bessel_kf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1f50047f9aab0ec8b1a1615fe9fbe32f',1,'cyl_bessel_kf()(Global Namespace)']]], - ['cyl_5fbessel_5fkl_2189',['cyl_bessel_kl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gac35194b926270d7857d651e06198c7d3',1,'std::cyl_bessel_kl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gac35194b926270d7857d651e06198c7d3',1,'cyl_bessel_kl()(Global Namespace)']]], - ['cyl_5fneumann_2190',['cyl_neumann',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga5b7c72ab85e361cbd73f1a3b5f0725a6',1,'std::cyl_neumann()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga36bb3adce8d3308d85891700c78bea91',1,'std::tr1::cyl_neumann()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga5b7c72ab85e361cbd73f1a3b5f0725a6',1,'cyl_neumann(_Tpnu __nu, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga36bb3adce8d3308d85891700c78bea91',1,'cyl_neumann(_Tpnu __nu, _Tp __x)(Global Namespace)']]], - ['cyl_5fneumannf_2191',['cyl_neumannf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga604c13e8f2bb7cd3c7c91d8b19d6b13a',1,'std::cyl_neumannf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga604c13e8f2bb7cd3c7c91d8b19d6b13a',1,'cyl_neumannf()(Global Namespace)']]], - ['cyl_5fneumannl_2192',['cyl_neumannl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf8986bae9a523c48d861d233835bda8f',1,'std::cyl_neumannl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf8986bae9a523c48d861d233835bda8f',1,'cyl_neumannl()(Global Namespace)']]], - ['cylindricalportraitprojector_2193',['CylindricalPortraitProjector',['https://docs.opencv.org/4.2.0/df/d3f/structcv_1_1detail_1_1CylindricalPortraitProjector.html',1,'cv::detail']]], - ['cylindricalportraitwarper_2194',['CylindricalPortraitWarper',['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1detail_1_1CylindricalPortraitWarper.html',1,'cv::detail::CylindricalPortraitWarper'],['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1detail_1_1CylindricalPortraitWarper.html#a6f71c3d46b911b845a03511cb71a4188',1,'cv::detail::CylindricalPortraitWarper::CylindricalPortraitWarper()']]], - ['cylindricalprojector_2195',['CylindricalProjector',['https://docs.opencv.org/4.2.0/dd/d96/structcv_1_1detail_1_1CylindricalProjector.html',1,'cv::detail']]], - ['cylindricalwarper_2196',['CylindricalWarper',['https://docs.opencv.org/4.2.0/d7/df6/classcv_1_1CylindricalWarper.html',1,'cv::CylindricalWarper'],['https://docs.opencv.org/4.2.0/d3/dd6/classcv_1_1detail_1_1CylindricalWarper.html',1,'cv::detail::CylindricalWarper'],['https://docs.opencv.org/4.2.0/d3/dd6/classcv_1_1detail_1_1CylindricalWarper.html#ac005b4b0e4bc4d7266f26fd4cc7e19dc',1,'cv::detail::CylindricalWarper::CylindricalWarper()']]], - ['cylindricalwarpergpu_2197',['CylindricalWarperGpu',['https://docs.opencv.org/4.2.0/d9/dbd/classcv_1_1detail_1_1CylindricalWarperGpu.html',1,'cv::detail::CylindricalWarperGpu'],['https://docs.opencv.org/4.2.0/d9/dbd/classcv_1_1detail_1_1CylindricalWarperGpu.html#a3af4ec2a705ff9f0f807d9e8bcac2b33',1,'cv::detail::CylindricalWarperGpu::CylindricalWarperGpu()']]], - ['cyrillic_2198',['cyrillic',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a0972c81463e8267ad1d8fb16ff72a803',1,'cv::QtFont']]] + ['chrono_693',['chrono',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00050.html',1,'']]], + ['cin_694',['cin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afdcd7ecbf1544ef3f79b89f0dd06c3b7',1,'std::cin'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afdcd7ecbf1544ef3f79b89f0dd06c3b7',1,'std::cin']]], + ['cinttypes_695',['cinttypes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00203.html',1,'']]], + ['circle_696',['Circle',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html',1,'cv::gapi::wip::draw::Circle'],['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#af2c26d99260ff2fe878cd6cfe620c0ce',1,'cv::gapi::wip::draw::Circle::Circle()']]], + ['circle_697',['circle',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a6f0d8b2d9e3e947b2a5c1eff9e81ee95',1,'cv::datasets::circle'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a6f0d8b2d9e3e947b2a5c1eff9e81ee95',1,'circle(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaf10604b069374903dbd0f0488cb43670',1,'cv::circle()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaf10604b069374903dbd0f0488cb43670',1,'circle(InputOutputArray img, Point center, int radius, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)']]], + ['circle_20transform_698',['Circle Transform',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_hough_circle.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/da/d53/tutorial_py_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d3/de5/tutorial_js_houghcircles.html',1,'Hough Circle Transform']]], + ['circles_20for_20contours_699',['Creating Bounding boxes and circles for contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'']]], + ['circlesgridfinderparameters_700',['CirclesGridFinderParameters',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html',1,'cv::CirclesGridFinderParameters'],['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#aa39cf0f1e03b45986072a05c8833836b',1,'cv::CirclesGridFinderParameters::CirclesGridFinderParameters()']]], + ['circlesgridfinderparameters2_701',['CirclesGridFinderParameters2',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga3f5d9f231e61d6e3190042fbe510c06c',1,'cv::CirclesGridFinderParameters2'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga3f5d9f231e61d6e3190042fbe510c06c',1,'CirclesGridFinderParameters2(Global Namespace)']]], + ['ciso646_702',['ciso646',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00206.html',1,'']]], + ['cl_20va_20interoperability_703',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], + ['clahe_704',['CLAHE',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1CLAHE.html',1,'cv::CLAHE'],['https://docs.opencv.org/4.2.0/db/d79/classcv_1_1cuda_1_1CLAHE.html',1,'cv::cuda::CLAHE']]], + ['claheclip_705',['claheClip',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#af5391b0a3989222e5ceffbdedbe0203c',1,'cv::optflow::OpticalFlowPCAFlow']]], + ['clamp_706',['clamp',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a683b454f1571780e8ddfc5d781949b51',1,'Eigen::AlignedBox::clamp()'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a96cbdbff03044a3fa5ce79d110863583',1,'cv::dnn::clamp(int ax, int dims)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a98715b4d79f58f3e24cdad247e9c8500',1,'cv::dnn::clamp(int ax, const MatShape &shape)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a62da460ae3a725e9e3aeca87f49168fd',1,'cv::dnn::clamp(const Range &r, int axisSize)']]], + ['clang_20format_20tt_707',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], + ['class_708',['class',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'High level stitching API (Stitcher class)'],['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'Interfacing with raw buffers: the Map class'],['https://eigen.tuxfamily.org/dox/group__TutorialMatrixClass.html',1,'The Matrix class']]], + ['class_20and_20coefficient_20wise_20operations_709',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], + ['class_20hierarchy_710',['The class hierarchy',['https://eigen.tuxfamily.org/dox/TopicClassHierarchy.html',1,'']]], + ['class_5fid_711',['class_id',['https://docs.opencv.org/4.2.0/d9/daa/structcvhalKeyPoint.html#aa61f9f75faea620531ecd6935b5c0edd',1,'cvhalKeyPoint::class_id'],['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a4a82cb1083a3e18d54b055a692b60eee',1,'cv::line_descriptor::KeyLine::class_id'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#aea339bc868102430087b659cd0709c11',1,'cv::KeyPoint::class_id'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a9b8335ac92b58248eecd9d3069e4cd22',1,'cv::linemod::Match::class_id']]], + ['class_5fidx_712',['class_idx',['https://docs.opencv.org/4.2.0/d4/d36/structcv_1_1dnn__objdetect_1_1object.html#ae84c369c19f07f6a58d81bebc74d8943',1,'cv::dnn_objdetect::object']]], + ['class_5fprob_713',['class_prob',['https://docs.opencv.org/4.2.0/d4/d36/structcv_1_1dnn__objdetect_1_1object.html#a36a09a37f76dd520b7ec9d9a2d53406d',1,'cv::dnn_objdetect::object']]], + ['class_5ftemplates_714',['class_templates',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#af9e4e10678d4d451ae66cae2f1b644bb',1,'cv::linemod::Detector']]], + ['classes_715',['Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01506.html',1,'Arithmetic Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01501.html',1,'Base and Implementation Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01497.html',1,'Base and Implementation Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01531.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01535.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01529.html',1,'Base and Policy Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01517.html',1,'Binder Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01508.html',1,'Boolean Operations Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01507.html',1,'Comparison Classes'],['https://docs.opencv.org/4.2.0/d8/dd0/group__gapi__main__classes.html',1,'G-API Main Classes']]], + ['classes_716',['Extending MatrixBase (and other classes)',['https://eigen.tuxfamily.org/dox/TopicCustomizing_Plugins.html',1,'']]], + ['classic_717',['classic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#aa50e351ed674a068ff3e179c5a75c21b',1,'std::locale']]], + ['classic_5ftable_718',['classic_table',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a747e7392c1a15e23869442fea9685aaf',1,'std::ctype< char >::classic_table()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a747e7392c1a15e23869442fea9685aaf',1,'std::ctype_byname< char >::classic_table()']]], + ['classid_719',['classID',['https://docs.opencv.org/4.2.0/d7/de4/structcv_1_1dpm_1_1DPMDetector_1_1ObjectDetection.html#ac84bee5fd3b49246aa9f94513970bf66',1,'cv::dpm::DPMDetector::ObjectDetection']]], + ['classids_720',['classIds',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a013280cc0d3d51df042ab12c5ab868d1',1,'cv::linemod::Detector']]], + ['classidx_721',['classIdx',['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#a267757421f3e930023b525c03018fcf0',1,'cv::ml::DTrees::Node']]], + ['classification_20and_20pose_20estimation_722',['CNN for 3D Object Classification and Pose Estimation',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'']]], + ['classificationmodel_723',['ClassificationModel',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1dnn_1_1ClassificationModel.html',1,'cv::dnn::ClassificationModel'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1dnn_1_1ClassificationModel.html#a60f36f932b42af8af345c59aef897e5f',1,'cv::dnn::ClassificationModel::ClassificationModel(const String &model, const String &config="")'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1dnn_1_1ClassificationModel.html#a05807a9b2c9dafcb39ce1f11f0e057e7',1,'cv::dnn::ClassificationModel::ClassificationModel(const Net &network)']]], + ['classifier_724',['Cascade Classifier',['https://docs.opencv.org/4.2.0/db/d28/tutorial_cascade_classifier.html',1,'']]], + ['classifier_725',['classifier',['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a295c34db17493346647f9e5239ada069',1,'cv::text::OCRBeamSearchDecoder::classifier'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#aafcd89c1ec5b53fad60c73a3648ea025',1,'cv::text::OCRHMMDecoder::classifier']]], + ['classifier_20training_726',['Cascade Classifier Training',['https://docs.opencv.org/4.2.0/dc/d88/tutorial_traincascade.html',1,'']]], + ['classifier_5ftype_727',['classifier_type',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga688d3bbaf5a5ac19ffe9633d7dc0156a',1,'cv::text::classifier_type'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#ga688d3bbaf5a5ac19ffe9633d7dc0156a',1,'classifier_type(Global Namespace)']]], + ['classifiercallback_728',['ClassifierCallback',['https://docs.opencv.org/4.2.0/de/d2d/classcv_1_1text_1_1OCRBeamSearchDecoder_1_1ClassifierCallback.html',1,'cv::text::OCRBeamSearchDecoder::ClassifierCallback'],['https://docs.opencv.org/4.2.0/db/dc0/classcv_1_1text_1_1OCRHMMDecoder_1_1ClassifierCallback.html',1,'cv::text::OCRHMMDecoder::ClassifierCallback']]], + ['classifiersize_729',['ClassifierSize',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#aba7ecad61d7632f75f2b48e7becb1bc1',1,'HaarClassifierCascadeDescriptor']]], + ['classifierthreshold_730',['ClassifierThreshold',['https://docs.opencv.org/4.2.0/d7/dd9/classcv_1_1ClassifierThreshold.html',1,'cv::ClassifierThreshold'],['https://docs.opencv.org/4.2.0/d7/dd9/classcv_1_1ClassifierThreshold.html#aee4340ecf2a8ec66d363aa01af22ebbd',1,'cv::ClassifierThreshold::ClassifierThreshold()']]], + ['classify_731',['Classify',['https://docs.opencv.org/4.2.0/df/d38/tutorial_feature_classification.html',1,'']]], + ['classify_732',['classify',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1dnn_1_1ClassificationModel.html#a57ce23e5667c524ec19e07eaead4492f',1,'cv::dnn::ClassificationModel::classify(InputArray frame)'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1dnn_1_1ClassificationModel.html#a1105095e3e262baea6fab4349387cc9a',1,'cv::dnn::ClassificationModel::classify(InputArray frame, int &classId, float &conf)'],['https://docs.opencv.org/4.2.0/dc/d72/classcv_1_1ClfMilBoost.html#a343f692f0989840609b5858da3f0c28c',1,'cv::ClfMilBoost::classify()'],['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a988c984eb44287fff8cb26369facf6c5',1,'cv::ClfOnlineStump::classify()']]], + ['classify_2emarkdown_733',['classify.markdown',['https://docs.opencv.org/4.2.0/d4/d6a/classify_8markdown.html',1,'']]], + ['classifyf_734',['classifyF',['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a14c56276f7c61d7674cd0125d0001b32',1,'cv::ClfOnlineStump']]], + ['classifysetf_735',['classifySetF',['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#ae4943ccbe6721410bab8efdc4eb63a17',1,'cv::ClfOnlineStump']]], + ['classifysmooth_736',['classifySmooth',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1Detector.html#a540b76d89d3c11c40961cf3f1178414d',1,'cv::Detector::classifySmooth()'],['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html#a355a6ae432a36547df9a62aa38937d84',1,'cv::StrongClassifierDirectSelection::classifySmooth()']]], + ['classname_737',['className',['https://docs.opencv.org/4.2.0/d9/dcd/classcv_1_1saliency_1_1Saliency.html#a63005f710830d5c331d680dc916c507a',1,'cv::saliency::Saliency::className'],['https://docs.opencv.org/4.2.0/d7/da2/classcv_1_1TrackerFeature.html#afdf155c9344c41facfa9b717e123db57',1,'cv::TrackerFeature::className'],['https://docs.opencv.org/4.2.0/dc/d75/classcv_1_1TrackerSamplerAlgorithm.html#a9778464a7b006d7e3b60e891e7d7905f',1,'cv::TrackerSamplerAlgorithm::className'],['https://docs.opencv.org/4.2.0/d2/db9/classcv_1_1TrackerStateEstimator.html#aa212b274bb6c3bf638979b6788f6071c',1,'cv::TrackerStateEstimator::className']]], + ['cleanup_738',['cleanup',['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#a02c27b7fb89eed095708c588af79ff1f',1,'cv::TLSData::cleanup()'],['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#a02c27b7fb89eed095708c588af79ff1f',1,'TLSData< cv::instr::NodeDataTls >::cleanup()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a3fe56df89fa57f6e7c9becf6d15a3454',1,'cv::TLSDataAccumulator::cleanup()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a3fe56df89fa57f6e7c9becf6d15a3454',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::cleanup()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#a60db91833dbbbcb7d3406b819de3b272',1,'cv::TLSDataContainer::cleanup()']]], + ['cleanupdetacheddata_739',['cleanupDetachedData',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a80211de7cf66b22d5408cbe873f7ffe2',1,'cv::TLSDataAccumulator::cleanupDetachedData()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a80211de7cf66b22d5408cbe873f7ffe2',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::cleanupDetachedData()']]], + ['clear_740',['clear',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a4efa6037afcc3e6c51451db17b5e76cf',1,'cv::_OutputArray::clear()'],['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#aec9c965448e4dc851d7cacd3abd84cd1',1,'cv::Algorithm::clear()'],['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html#a6ce738fed1ec74e2c73c698aac632d96',1,'cv::line_descriptor::BinaryDescriptorMatcher::clear()'],['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#a54968befe8957d2691fc8e492aeea72c',1,'cv::BOWTrainer::clear()'],['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a696d5029646669ce9b8bc2c98dc7706f',1,'cv::DescriptorMatcher::DescriptorCollection::clear()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a01f97324f1393aae68d9c84874060454',1,'cv::DescriptorMatcher::clear()'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a1450110e5dd90c1f50e94232bbacb408',1,'cv::cuda::DescriptorMatcher::clear()'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a321910c88a7d8a887843ce2173f58a6e',1,'cv::FlannBasedMatcher::clear()'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#af5b0241d5aed2b281fa06ee44035db7c',1,'cv::SparseMat::Hdr::clear()'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#a5b9526bed58f7dd32807de1fa4bffacd',1,'NCVMatrix::clear()'],['https://docs.opencv.org/4.2.0/d6/d86/structNCVMemPtr.html#a6756da2769710936ae259a9ae8164584',1,'NCVMemPtr::clear()'],['https://docs.opencv.org/4.2.0/d2/d12/structNCVMemSegment.html#a70429f73536c036be44899623cb74b54',1,'NCVMemSegment::clear()'],['https://docs.opencv.org/4.2.0/dc/d73/classNCVVector.html#a6e4266667afe348817d08a7363330462',1,'NCVVector::clear()'],['https://docs.opencv.org/4.2.0/da/d83/classcv_1_1quality_1_1QualityBase.html#a6b1ecba1e463610e584e67222d59064f',1,'cv::quality::QualityBase::clear()'],['https://docs.opencv.org/4.2.0/d8/d81/classcv_1_1quality_1_1QualityGMSD.html#adb3c0ad4b55d524f3ec3cb499756a0fc',1,'cv::quality::QualityGMSD::clear()'],['https://docs.opencv.org/4.2.0/d7/d80/classcv_1_1quality_1_1QualityMSE.html#a64ca28049724f66c76f1cd309d65722e',1,'cv::quality::QualityMSE::clear()'],['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#adcac059e137150e7627f87c971a00d41',1,'cv::quality::QualityPSNR::clear()'],['https://docs.opencv.org/4.2.0/d9/db5/classcv_1_1quality_1_1QualitySSIM.html#ac527e54b09d8f8375be2403426724709',1,'cv::quality::QualitySSIM::clear()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a2fa705d84961513f6e0b0066ec245a8e',1,'cv::SparseMat::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab778e468351ba1d0365bccda523e1eba',1,'__gnu_cxx::__versa_string::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'basic_ios< char, _Traits >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'basic_iostream< char >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'basic_istream< char >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'basic_istream< char, _Traits >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'basic_ostream< char >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'basic_ostream< char, _Traits >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< _CharT >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< _CharT, _Traits, _Allocator >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< char >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< char, char_traits< char >, _Byte_alloc >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< char_type, _Traits, _Alloc >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'basic_string< value_type >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a1a753bfa9e6b675bac7ee9ec4365fbdf',1,'deque< _StateSeqT >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ae36feac84d9e8125b700ce5189ed9e95',1,'list< __inp, __rebind_inp >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'match_results< _Bi_iter >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_fstream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_ifstream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_ios::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_iostream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_istream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_istringstream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_ofstream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_ostream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_ostringstream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf800493abc5157b122532f5553c7473',1,'std::basic_string::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a07a10e07246ef2a68c0c3f08d94c7607',1,'std::basic_stringstream::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a1a753bfa9e6b675bac7ee9ec4365fbdf',1,'std::deque::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a5beaf2ef0d35c15246261ecce68809b0',1,'std::experimental::fundamentals_v1::any::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aa88c1d40b71b3724ca63da3b66d4a5e0',1,'std::forward_list::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ae36feac84d9e8125b700ce5189ed9e95',1,'std::list::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a5c72b2772d31bff52f9454a583547f58',1,'std::map::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'std::match_results::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a31487eed37318f2466fdf59e0d150e81',1,'std::multimap::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ace71f2e5ccf1cf04f7684fe40490f9d6',1,'std::multiset::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ad06b71a81f86eca8862b0cbc0572622c',1,'std::set::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae9ed6af5f774f6eb904fe29b21a0c013',1,'std::tr2::dynamic_bitset::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a9728c777ec0429619531a26201560c18',1,'std::unordered_map::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a96159c845937ab5729b5ed41a7ef6071',1,'std::unordered_multimap::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a18e69290f6407ee6a2de58b005f4309e',1,'std::unordered_multiset::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ad8049c5e823b2e158de097c48b4bcb0d',1,'std::unordered_set::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'std::vector::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a9728c777ec0429619531a26201560c18',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< __diff_type >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _CharClassT >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _CharT >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _Cmpt >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _Node *, _Nodeptr_Alloc >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _RealType >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _State< _TraitsT::char_type > >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< _StringT >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< block_type, allocator_type >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< Catalog_info * >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< double >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< int >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< result_type >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< size_t >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< std::pair< _BiIter, int > >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< std::pair< _StateIdT, std::vector > >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< std::pair< _StrTransT, _StrTransT > >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< sub_match< _Bi_iter >, _Alloc >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::clear()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a57ef261b05f9ea1457d6f54494902e84',1,'vector< sub_match< _BiIter >, _Alloc >::clear()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a946cc8f30d8b1d6609b57387b647fe53.html#a946cc8f30d8b1d6609b57387b647fe53',1,'nlohmann::basic_json::clear()'],['../classutil_1_1PeriodicScheduler.html#ac657af10208f7e1c9b31abc17988b316',1,'util::PeriodicScheduler::clear()']]], + ['clear_5fsubtype_741',['clear_subtype',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a7b122b28ff2b8680557ca44ac9748e49.html#a7b122b28ff2b8680557ca44ac9748e49',1,'nlohmann::byte_container_with_subtype']]], + ['clearallbuffers_742',['clearAllBuffers',['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#afc20fcba4a50aedc2f4d8919588bb911',1,'cv::bioinspired::TransientAreasSegmentationModule']]], + ['clearbuffers_743',['clearBuffers',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a09603d1ed6c8f82459526bbe2ac4eac6',1,'cv::bioinspired::Retina']]], + ['cleargraphsegmentations_744',['clearGraphSegmentations',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a301547b9a40db0da72aeb713f15de5b5',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], + ['clearimages_745',['clearImages',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a278455e3f341f14d755305b3bb80317a',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], + ['clearstat_746',['ClearStat',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a600bc14c62384d9e0fd6ba86887c0faa',1,'cv::cudacodec::EncoderParams']]], + ['clearstrategies_747',['clearStrategies',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a63b7cae2e58f2a47bb533928f998b6e2',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation::clearStrategies()'],['https://docs.opencv.org/4.2.0/d8/d8e/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategyMultiple.html#ae9e541d9caabdebc4810c65164e736a4',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentationStrategyMultiple::clearStrategies()']]], + ['cleartrainingmodels_748',['clearTrainingModels',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a3fbd9d01c645212a35dc885ca3100fc7',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['clearvoronoi_749',['clearVoronoi',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#ae3a27a930a710466051547b80dd64ef1',1,'cv::Subdiv2D']]], + ['clfmilboost_750',['ClfMilBoost',['https://docs.opencv.org/4.2.0/dc/d72/classcv_1_1ClfMilBoost.html',1,'cv::ClfMilBoost'],['https://docs.opencv.org/4.2.0/dc/d72/classcv_1_1ClfMilBoost.html#aeb293336072f7eda8f1cc8bd6678aa7b',1,'cv::ClfMilBoost::ClfMilBoost()']]], + ['clfonlinestump_751',['ClfOnlineStump',['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html',1,'cv::ClfOnlineStump'],['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a0dae599812f552049b9247f1ecb3171f',1,'cv::ClfOnlineStump::ClfOnlineStump()'],['https://docs.opencv.org/4.2.0/dc/dac/classcv_1_1ClfOnlineStump.html#a1d574dc40c0f453aeb60162f3ad396bd',1,'cv::ClfOnlineStump::ClfOnlineStump(int ind)']]], + ['climits_752',['climits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00209.html',1,'']]], + ['clipline_753',['clipLine',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaf483cb46ad6b049bc35ec67052ef1c2c',1,'cv::clipLine(Size imgSize, Point &pt1, Point &pt2)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gab156b52ae9174369cb035f1e9dfb29e1',1,'cv::clipLine(Size2l imgSize, Point2l &pt1, Point2l &pt2)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga36117422ae2f891c7b03023261e25928',1,'cv::clipLine(Rect imgRect, Point &pt1, Point &pt2)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gaf483cb46ad6b049bc35ec67052ef1c2c',1,'clipLine(Size imgSize, Point &pt1, Point &pt2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gab156b52ae9174369cb035f1e9dfb29e1',1,'clipLine(Size2l imgSize, Point2l &pt1, Point2l &pt2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga36117422ae2f891c7b03023261e25928',1,'clipLine(Rect imgRect, Point &pt1, Point &pt2)(Global Namespace)']]], + ['clocale_754',['clocale',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00212.html',1,'']]], + ['clockrate_755',['clockRate',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8529cf2de8f281ce95d9350da1b2e210',1,'cv::cuda::DeviceInfo']]], + ['clog_756',['clog',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7e2a2fc4b5924b7292c0566ca4c95463',1,'std::clog'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7e2a2fc4b5924b7292c0566ca4c95463',1,'std::clog']]], + ['clojure_757',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], + ['clojure_5fdev_5fintro_2emarkdown_758',['clojure_dev_intro.markdown',['https://docs.opencv.org/4.2.0/da/d37/clojure__dev__intro_8markdown.html',1,'']]], + ['clone_759',['clone',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#a117b4667faf1974e5a3f0b8d7ba1c0a1',1,'cv::BFMatcher::clone()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#aa0c8b81f03de2d386bce302ccd9bd431',1,'cv::ogl::Buffer::clone()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a8d0dfab3c560c3edada03155c97ed8a9',1,'cv::DescriptorMatcher::clone()'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#aa181710f75e8be9539939247b645557b',1,'cv::FlannBasedMatcher::clone()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ae1d42819f7f3251478cd6edab8069758',1,'cv::cuda::GpuMat::clone()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a3a157968855ce36fd7045b57eaae6639',1,'cv::cudev::GpuMat_::clone()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a29b76f344d85d77b4c51478cfebbbd28',1,'cv::cuda::HostMem::clone()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#adff2ea98da45eae0833e73582dd4a660',1,'cv::Mat::clone()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac1e023d30dbb85d9e6773f01dc521f24',1,'cv::Mat_::clone()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac1e023d30dbb85d9e6773f01dc521f24',1,'Mat_< double >::clone()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac1e023d30dbb85d9e6773f01dc521f24',1,'Mat_< float >::clone()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac1e023d30dbb85d9e6773f01dc521f24',1,'Mat_< uchar >::clone()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac1e023d30dbb85d9e6773f01dc521f24',1,'Mat_< unsigned char >::clone()'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a0502d5c729cf16937f1ad2fbf7baed65',1,'cv::ppf_match_3d::Pose3D::clone()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a230a36b59925a5e300a703ae1186856b',1,'cv::SparseMat::clone()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#abf80a5f4b7c7d33c97b9189d5587613e',1,'cv::SparseMat_::clone()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aac63c68170021973b171e94746c253ac',1,'cv::UMat::clone()']]], + ['clone_5fop_760',['clone_op',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a7aa961c11ccdc6a9b1495f5aaf83d251',1,'cv::DescriptorMatcher']]], + ['cloning_761',['Seamless Cloning',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html',1,'']]], + ['close_762',['close',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#a559351f76c3c3d69a7560ac67a72687c',1,'cv::AVIReadContainer::close()'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#aa56606dd84312a4c1010f0e6e918fd9b',1,'cv::hdf::HDF5::close()'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a600d62f9dd17f1bfb71e7331b021ec6d',1,'cv::viz::Viz3d::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a5e13a128abb0a5dd8ef1e3d10597031f',1,'__gnu_cxx::enc_filebuf::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a5e13a128abb0a5dd8ef1e3d10597031f',1,'__gnu_cxx::stdio_filebuf::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a5e13a128abb0a5dd8ef1e3d10597031f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a5e13a128abb0a5dd8ef1e3d10597031f',1,'basic_filebuf< char_type, traits_type >::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#a5e13a128abb0a5dd8ef1e3d10597031f',1,'std::basic_filebuf::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02079.html#adf2ca5f243067d406a96f91763173839',1,'std::basic_fstream::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02071.html#adca6a6b93f9f3ae1c9393213caa37a9a',1,'std::basic_ifstream::close()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02075.html#a63e51ce67bbd3eee66b04851100a8a52',1,'std::basic_ofstream::close()']]], + ['close_5fcamera_763',['CLOSE_CAMERA',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html#gga5291115322efc2f86c7551ab37ab6554a5a4ff95ee598bda6d396d9c2170b2583',1,'cv::CLOSE_CAMERA'],['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html#gga5291115322efc2f86c7551ab37ab6554a5a4ff95ee598bda6d396d9c2170b2583',1,'CLOSE_CAMERA(Global Namespace)']]], + ['closestheading_764',['closestHeading',['../namespaceutil.html#aa10a4493a1c38a1868ea8af92bac1503',1,'util']]], + ['closestream_765',['closeStream',['../classnet_1_1mc_1_1tasks_1_1CameraStreamTask.html#a718c1930e0f994cec8d7d6363b4a3690',1,'net::mc::tasks::CameraStreamTask']]], + ['cloud_766',['cloud',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a2719f6673412252b5539191b5d8db580',1,'cv::viz::Mesh']]], + ['cls_767',['cls',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a4edc0824e04404495ae77fb97cf2fdc1',1,'cv::CvFeatureEvaluator']]], + ['cluster_768',['cluster',['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#a489bdcbdbc8f1d470683e3c375b1a4df',1,'cv::BOWKMeansTrainer::cluster() const CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#a0ac921f4781724dbd4b2ce06e34c304f',1,'cv::BOWKMeansTrainer::cluster(const Mat &descriptors) const CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#abbd3b3cb63690fa7128db1a1fcb84eab',1,'cv::BOWTrainer::cluster() const=0'],['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#ab869df2d888741c37e33c06eee8d54dc',1,'cv::BOWTrainer::cluster(const Mat &descriptors) const=0']]], + ['clustercount_769',['clusterCount',['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#aec28a6dd06354f4b13462434e1f39e03',1,'cv::BOWKMeansTrainer']]], + ['clustering_770',['Clustering',['https://docs.opencv.org/4.2.0/d5/d38/group__core__cluster.html',1,'Clustering'],['https://docs.opencv.org/4.2.0/d9/d70/tutorial_py_kmeans_index.html',1,'K-Means Clustering'],['https://docs.opencv.org/4.2.0/de/d4d/tutorial_py_kmeans_understanding.html',1,'Understanding K-Means Clustering']]], + ['clustering_20and_20search_20in_20multi_20dimensional_20spaces_771',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], + ['clustering_20in_20opencv_772',['K-Means Clustering in OpenCV',['https://docs.opencv.org/4.2.0/d1/d5c/tutorial_py_kmeans_opencv.html',1,'']]], + ['cmake_773',['Using OpenCV with gcc and CMake',['https://docs.opencv.org/4.2.0/db/df5/tutorial_linux_gcc_cmake.html',1,'']]], + ['cmake_20projects_774',['Using Eigen in CMake Projects',['https://eigen.tuxfamily.org/dox/TopicCMakeGuide.html',1,'']]], + ['cmake_20version_203_209_201_775',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['cmath_776',['cmath',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00215.html',1,'']]], + ['cmp16s_777',['cmp16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga4cbdcc03d0a35df354db3b9ffc8a05e3',1,'cv::hal::cmp16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga4cbdcc03d0a35df354db3b9ffc8a05e3',1,'cmp16s()(Global Namespace)']]], + ['cmp16u_778',['cmp16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf5331cf7cc620dd06390a7a4ad337240',1,'cv::hal::cmp16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf5331cf7cc620dd06390a7a4ad337240',1,'cmp16u()(Global Namespace)']]], + ['cmp32f_779',['cmp32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga822695283d4dc9f2bf882fea9dccee9f',1,'cv::hal::cmp32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga822695283d4dc9f2bf882fea9dccee9f',1,'cmp32f()(Global Namespace)']]], + ['cmp32s_780',['cmp32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga74d6cc76af8045b57be921340f437d62',1,'cv::hal::cmp32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga74d6cc76af8045b57be921340f437d62',1,'cmp32s()(Global Namespace)']]], + ['cmp64f_781',['cmp64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaab047b38298429955aa9aeb0c2148047',1,'cv::hal::cmp64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaab047b38298429955aa9aeb0c2148047',1,'cmp64f()(Global Namespace)']]], + ['cmp8s_782',['cmp8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga84dd422284915a26720959fe79b7fb04',1,'cv::hal::cmp8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga84dd422284915a26720959fe79b7fb04',1,'cmp8s()(Global Namespace)']]], + ['cmp8u_783',['cmp8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga12c4782d42112f392d07931e02cb6de7',1,'cv::hal::cmp8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga12c4782d42112f392d07931e02cb6de7',1,'cmp8u()(Global Namespace)']]], + ['cmp_5feq_784',['CMP_EQ',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a878fbe5d23e277c3d87128a8844e639d',1,'cv::CMP_EQ'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a878fbe5d23e277c3d87128a8844e639d',1,'CMP_EQ(Global Namespace)']]], + ['cmp_5ffn_785',['cmp_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#acb3bfca7ffae5a572e1a8698bf0c1255',1,'__gnu_pbds::tree']]], + ['cmp_5ffn_5fimps_2ehpp_786',['cmp_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01244.html',1,'']]], + ['cmp_5fge_787',['CMP_GE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a0dd1b1a6fa443343f44aef8c52942625',1,'cv::CMP_GE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a0dd1b1a6fa443343f44aef8c52942625',1,'CMP_GE(Global Namespace)']]], + ['cmp_5fgt_788',['CMP_GT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784ada5167eceeaca5a3dc9d7f6a96255827',1,'cv::CMP_GT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784ada5167eceeaca5a3dc9d7f6a96255827',1,'CMP_GT(Global Namespace)']]], + ['cmp_5fle_789',['CMP_LE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a45cc5be6c7f35292542aa7c00ce4cf1c',1,'cv::CMP_LE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a45cc5be6c7f35292542aa7c00ce4cf1c',1,'CMP_LE(Global Namespace)']]], + ['cmp_5flt_790',['CMP_LT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a5a747de43c04d59b6e51a2959a8af105',1,'cv::CMP_LT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a5a747de43c04d59b6e51a2959a8af105',1,'CMP_LT(Global Namespace)']]], + ['cmp_5fne_791',['CMP_NE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a7997997a104b827c918884b6c5ee0e59',1,'cv::CMP_NE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gga0cc47ff833d40b58ecbe1d609a53d784a7997997a104b827c918884b6c5ee0e59',1,'CMP_NE(Global Namespace)']]], + ['cmpeq_792',['cmpEQ',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaea61a43cc393b6bfa81fc57007df28d2',1,'cv::gapi::cmpEQ(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga947f0104b91a77f40430b226fccdd2f0',1,'cv::gapi::cmpEQ(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaea61a43cc393b6bfa81fc57007df28d2',1,'cmpEQ(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga947f0104b91a77f40430b226fccdd2f0',1,'cmpEQ(const GMat &src1, const GScalar &src2)(Global Namespace)']]], + ['cmpge_793',['cmpGE',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga2b13187939387e99b4a7dbc497d9d52d',1,'cv::gapi::cmpGE(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga6e4dd0a6dd8f9420d2f6635c912fb396',1,'cv::gapi::cmpGE(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga2b13187939387e99b4a7dbc497d9d52d',1,'cmpGE(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga6e4dd0a6dd8f9420d2f6635c912fb396',1,'cmpGE(const GMat &src1, const GScalar &src2)(Global Namespace)']]], + ['cmpgt_794',['cmpGT',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gae7804b39335c3a62d21e7afd1c1fa566',1,'cv::gapi::cmpGT(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga19547e74738ea21e6c97d1149dddb6ef',1,'cv::gapi::cmpGT(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gae7804b39335c3a62d21e7afd1c1fa566',1,'cmpGT(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga19547e74738ea21e6c97d1149dddb6ef',1,'cmpGT(const GMat &src1, const GScalar &src2)(Global Namespace)']]], + ['cmple_795',['cmpLE',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga1a745b957e7f94c416a5773a13524576',1,'cv::gapi::cmpLE(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gab9df2b0aac068354dabb781a7250cdc4',1,'cv::gapi::cmpLE(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga1a745b957e7f94c416a5773a13524576',1,'cmpLE(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gab9df2b0aac068354dabb781a7250cdc4',1,'cmpLE(const GMat &src1, const GScalar &src2)(Global Namespace)']]], + ['cmplt_796',['cmpLT',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaa67732d475ab1df386eebff7b90895da',1,'cv::gapi::cmpLT(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga916e9433be97f99b0d6992ac1d1926de',1,'cv::gapi::cmpLT(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaa67732d475ab1df386eebff7b90895da',1,'cmpLT(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga916e9433be97f99b0d6992ac1d1926de',1,'cmpLT(const GMat &src1, const GScalar &src2)(Global Namespace)']]], + ['cmpne_797',['cmpNE',['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga6646d5a6e2ed232281fddd08d2a52772',1,'cv::gapi::cmpNE(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaac184e5ab0dc3b1ee74775c6bdc634e2',1,'cv::gapi::cmpNE(const GMat &src1, const GScalar &src2)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#ga6646d5a6e2ed232281fddd08d2a52772',1,'cmpNE(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html#gaac184e5ab0dc3b1ee74775c6bdc634e2',1,'cmpNE(const GMat &src1, const GScalar &src2)(Global Namespace)']]], + ['cmptypes_798',['CmpTypes',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0cc47ff833d40b58ecbe1d609a53d784',1,'cv::CmpTypes'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0cc47ff833d40b58ecbe1d609a53d784',1,'CmpTypes(Global Namespace)']]], + ['cn_799',['CN',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#a2a97c5b832651524b8e782496b933d45abdd27d54b8b8e5d80e392a1a40c18fe1',1,'cv::TrackerKCF']]], + ['cn_800',['cn',['https://docs.opencv.org/4.2.0/dc/df8/structcv_1_1cudev_1_1VecTraits_3_01char1_01_4.html#ae8807eab22e09639bac1c77010891db0a0887f0bf7575fa61bbb8c219e2931398',1,'cv::cudev::VecTraits< char1 >::cn'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1cudev_1_1VecTraits_3_01char2_01_4.html#ab397210ae3a1d3ac2aff16b666b2a614a866c28ba41d9eac9ca97dcde8046c4e1',1,'cv::cudev::VecTraits< char2 >::cn'],['https://docs.opencv.org/4.2.0/df/de4/structcv_1_1cudev_1_1VecTraits_3_01char3_01_4.html#a161a54c33544af83c6f93a4e7bbc736ca810ad6828fcbe6917ab982c45a7791ca',1,'cv::cudev::VecTraits< char3 >::cn'],['https://docs.opencv.org/4.2.0/dc/df6/structcv_1_1cudev_1_1VecTraits_3_01char4_01_4.html#a9d82b4027ca3001951a7650501746c49a0c04ed059b66b7582d5fa19df51787e6',1,'cv::cudev::VecTraits< char4 >::cn'],['https://docs.opencv.org/4.2.0/d1/d4e/structcv_1_1cudev_1_1VecTraits_3_01double_01_4.html#a0cc7f0ea115daf0ba3bc859904b6b71fafb865c68bb78e8e4f31a1f95536f6769',1,'cv::cudev::VecTraits< double >::cn'],['https://docs.opencv.org/4.2.0/d1/de1/structcv_1_1cudev_1_1VecTraits_3_01double1_01_4.html#afa9539490e407da9e35220b354e73defa22986735ee0c252c3858220cd9971851',1,'cv::cudev::VecTraits< double1 >::cn'],['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1VecTraits_3_01double2_01_4.html#a35d37a9e1d2131d515b04380b0be70e9a59f9c1ac43f38a2427db160aa43c67ee',1,'cv::cudev::VecTraits< double2 >::cn'],['https://docs.opencv.org/4.2.0/d5/d24/structcv_1_1cudev_1_1VecTraits_3_01double3_01_4.html#a82086d4574f4a544fd1ed1354281382aa5aea1f06ec7fb53491ac4d503713df77',1,'cv::cudev::VecTraits< double3 >::cn'],['https://docs.opencv.org/4.2.0/d1/d5d/structcv_1_1cudev_1_1VecTraits_3_01double4_01_4.html#a8f5f97e6409e888cef52d38312fc9c7aa91e28159bc11e937807e3c58f35468b0',1,'cv::cudev::VecTraits< double4 >::cn'],['https://docs.opencv.org/4.2.0/d0/d48/structcv_1_1cudev_1_1VecTraits_3_01float_01_4.html#af3a14a81c356ea7a70cb9ec81f6e1948aa095f47aed4b3c57a477ef3ba11f1b5e',1,'cv::cudev::VecTraits< float >::cn'],['https://docs.opencv.org/4.2.0/dc/d22/structcv_1_1cudev_1_1VecTraits_3_01float1_01_4.html#a7655f9ced40cf11548e0fd1e8bf88b31ad0fd865636e8227ffc131bdece00502d',1,'cv::cudev::VecTraits< float1 >::cn'],['https://docs.opencv.org/4.2.0/d9/dfe/structcv_1_1cudev_1_1VecTraits_3_01float2_01_4.html#a2ed991fac6c5cf3544a4085e5d035b5ba0e23b144bea2bd0bb0a1d6b96f4a77f5',1,'cv::cudev::VecTraits< float2 >::cn'],['https://docs.opencv.org/4.2.0/d9/d1a/structcv_1_1cudev_1_1VecTraits_3_01float3_01_4.html#aebe4e0f9b5f588af37c7ad5daa2c571ba27a095590a714ce9d315768c2d4e86e9',1,'cv::cudev::VecTraits< float3 >::cn'],['https://docs.opencv.org/4.2.0/d9/d9c/structcv_1_1cudev_1_1VecTraits_3_01float4_01_4.html#a652718881ac1ee6fa5539f259fa98167aca12f48fdf94fbbd6cda178f7f823a09',1,'cv::cudev::VecTraits< float4 >::cn'],['https://docs.opencv.org/4.2.0/d7/dc2/structcv_1_1cudev_1_1VecTraits_3_01int1_01_4.html#a44c81cb7c73207f347f44baa1f0ec4deaeb6ca6c0b10d300728108ac09f742666',1,'cv::cudev::VecTraits< int1 >::cn'],['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1VecTraits_3_01int2_01_4.html#a13a65546037ee5ed83720fbf005316cbadf3e8a47e667f2e0395b5fc9cc9ef02d',1,'cv::cudev::VecTraits< int2 >::cn'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1VecTraits_3_01int3_01_4.html#aa1d2cc4b6dd8bcd19a9745038bc9404ea0144ac25f8f3eb5c4e4de6093ee892c6',1,'cv::cudev::VecTraits< int3 >::cn'],['https://docs.opencv.org/4.2.0/da/d75/structcv_1_1cudev_1_1VecTraits_3_01int4_01_4.html#a9cb48b9378b44382cea7eaf5aaa7a3bcacdd1f31c8935e718f4748578679382bd',1,'cv::cudev::VecTraits< int4 >::cn'],['https://docs.opencv.org/4.2.0/d4/d43/structcv_1_1cudev_1_1VecTraits_3_01schar_01_4.html#a3731dabc6b26014fff21e0de2c6a0065a0f2717a73449e3809e01f9b0d8a51f31',1,'cv::cudev::VecTraits< schar >::cn'],['https://docs.opencv.org/4.2.0/da/df0/structcv_1_1cudev_1_1VecTraits_3_01short_01_4.html#ac5cf27c7a3b0796552b95d2b69862af7a470b70491c09549908ee51fd788fb515',1,'cv::cudev::VecTraits< short >::cn'],['https://docs.opencv.org/4.2.0/d6/dec/structcv_1_1cudev_1_1VecTraits_3_01short1_01_4.html#ada37eb577efc1a21e21e454e4b330a53a7a61b37c695fe793e436184430f7883c',1,'cv::cudev::VecTraits< short1 >::cn'],['https://docs.opencv.org/4.2.0/dd/d78/structcv_1_1cudev_1_1VecTraits_3_01short2_01_4.html#a8400ebcedc05799a03324705cd1f5ac6afeb13647e349e519b58493a44714780c',1,'cv::cudev::VecTraits< short2 >::cn'],['https://docs.opencv.org/4.2.0/da/d6d/structcv_1_1cudev_1_1VecTraits_3_01short3_01_4.html#a9f522ee86dbc3fc35145b008c484f750a031073946bb24c67a8e78f2bd37a56c5',1,'cv::cudev::VecTraits< short3 >::cn'],['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1VecTraits_3_01short4_01_4.html#a4c229c74d9755e4599f64c10293265e8afe34ac324bc5a5caa2673912453d93c5',1,'cv::cudev::VecTraits< short4 >::cn'],['https://docs.opencv.org/4.2.0/df/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar_01_4.html#a64a5f8c02a63702e2e1d83b43b265088a94301d78e8fa0b6cab848635d2a984ef',1,'cv::cudev::VecTraits< uchar >::cn'],['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar1_01_4.html#aa5034b7de2850b6d6dd28556ba5ba6b2ad8d6a2cfb52b3816ea5ec3777eb8d245',1,'cv::cudev::VecTraits< uchar1 >::cn'],['https://docs.opencv.org/4.2.0/d0/da8/structcv_1_1cudev_1_1VecTraits_3_01uchar2_01_4.html#a93eb29b11470dd42f8f1cc556de33cfcab96c4cf57d01c9bb4cdab43268b932d2',1,'cv::cudev::VecTraits< uchar2 >::cn'],['https://docs.opencv.org/4.2.0/da/d8a/structcv_1_1cudev_1_1VecTraits_3_01uchar3_01_4.html#aab981b0faf5127a0fa4a99d82d8e10f9ad6201eb2813e8de1b9b1c0616f731b25',1,'cv::cudev::VecTraits< uchar3 >::cn'],['https://docs.opencv.org/4.2.0/d4/dc1/structcv_1_1cudev_1_1VecTraits_3_01uchar4_01_4.html#a176d09042450c5513596c0a382aa7683aea90dc6b8d254db8996aa858ea1d0876',1,'cv::cudev::VecTraits< uchar4 >::cn'],['https://docs.opencv.org/4.2.0/de/d87/structcv_1_1cudev_1_1VecTraits_3_01uint_01_4.html#aa8c714090accbd28ff17fac983f2599da4b8df1a1ff6c65a4336b27b0a6a251c7',1,'cv::cudev::VecTraits< uint >::cn'],['https://docs.opencv.org/4.2.0/de/d41/structcv_1_1cudev_1_1VecTraits_3_01uint1_01_4.html#a2bff6b19fef8faf5ec7a8da2abf4d176a6ca4aec6b9dea7ce42752e17110cd801',1,'cv::cudev::VecTraits< uint1 >::cn'],['https://docs.opencv.org/4.2.0/d7/d19/structcv_1_1cudev_1_1VecTraits_3_01uint2_01_4.html#a907682bcd6d2d60d773c4c95ef36de1ba093f1270803a694a481dc581c23c6ff2',1,'cv::cudev::VecTraits< uint2 >::cn'],['https://docs.opencv.org/4.2.0/da/d00/structcv_1_1cudev_1_1VecTraits_3_01uint3_01_4.html#a3478d28c8ff3f145fd3b2c6362b93f65ac044744a2cfee6b05c861777fcda2bd5',1,'cv::cudev::VecTraits< uint3 >::cn'],['https://docs.opencv.org/4.2.0/dc/d7c/structcv_1_1cudev_1_1VecTraits_3_01uint4_01_4.html#a524289c241acd2fab6073ade39930d4aa681edf5831031ffc3a4db4f34c150e26',1,'cv::cudev::VecTraits< uint4 >::cn'],['https://docs.opencv.org/4.2.0/d9/db8/structcv_1_1cudev_1_1VecTraits_3_01ushort_01_4.html#a11daa5946ed173961f2be099de203e09a7d54dde82283ff456c9767ebbeecb530',1,'cv::cudev::VecTraits< ushort >::cn'],['https://docs.opencv.org/4.2.0/da/d76/structcv_1_1cudev_1_1VecTraits_3_01ushort1_01_4.html#a8045ac31178b2d3ee771a91858493140a47f220862dfa62e44fffca1a60e2c28a',1,'cv::cudev::VecTraits< ushort1 >::cn'],['https://docs.opencv.org/4.2.0/d0/d40/structcv_1_1cudev_1_1VecTraits_3_01ushort2_01_4.html#a9772040257ac14a7a62b1bd05ac9065dad67f4094e48fa58f9712e9ef6ffb9b3e',1,'cv::cudev::VecTraits< ushort2 >::cn'],['https://docs.opencv.org/4.2.0/d4/dd7/structcv_1_1cudev_1_1VecTraits_3_01ushort3_01_4.html#ad3382979d7e87b95026f12005017ca07a876e11f1d920b9dcbae74115dffbf5a5',1,'cv::cudev::VecTraits< ushort3 >::cn'],['https://docs.opencv.org/4.2.0/d3/d14/structcv_1_1cudev_1_1VecTraits_3_01ushort4_01_4.html#ad2389b50b0227ab35034175763e33b5ba216d55c9f868f4f21b87de6e64ebc120',1,'cv::cudev::VecTraits< ushort4 >::cn']]], + ['cn_20tracker_801',['Customizing the CN Tracker',['https://docs.opencv.org/4.2.0/dc/db8/tutorial_customizing_cn_tracker.html',1,'']]], + ['cnn_20for_203d_20object_20classification_20and_20pose_20estimation_802',['CNN for 3D Object Classification and Pose Estimation',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'']]], + ['cnn_5f3dobj_2ehpp_803',['cnn_3dobj.hpp',['https://docs.opencv.org/4.2.0/de/d45/cnn__3dobj_8hpp.html',1,'']]], + ['cnns_804',['CNNs',['https://docs.opencv.org/4.2.0/d2/da2/tutorial_dnn_objdetect.html',1,'Object Detection using CNNs'],['https://docs.opencv.org/4.2.0/d8/df8/tutorial_table_of_content_dnn_superres.html',1,'Super Resolution using CNNs']]], + ['coarseparams_805',['coarseParams',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#ae4afa6666e23d21522270c6c78769823',1,'cv::dynafu::Params::coarseParams()'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a8164c3adc75f3d3e548fbf806a0eb329',1,'cv::kinfu::Params::coarseParams()']]], + ['code_806',['Code',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abcca',1,'cv::Error']]], + ['code_807',['code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'Basic concepts of the homography explained with code'],['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a81405b438c930b556e9c71210d799e2b',1,'cv::Exception::code'],['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#a90f5e8b6d152aa7f1ecf4a5098020c74',1,'cv::viz::KeyboardEvent::code'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06867.html#a3fa7937e28854ac53d3e7b51e1cca6a3',1,'std::regex_error::code()'],['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'How to use the OpenCV parallel_for_ to parallelize your code']]], + ['code_20pattern_20tutorial_808',['code pattern tutorial',['https://docs.opencv.org/4.2.0/db/d56/tutorial_capture_graycode_pattern.html',1,'Capture Gray code pattern tutorial'],['https://docs.opencv.org/4.2.0/dc/da9/tutorial_decode_graycode_pattern.html',1,'Decode Gray code pattern tutorial']]], + ['codec_809',['Codec',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga71943a1181287609b5d649f53ce6c146',1,'cv::cudacodec::Codec'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga71943a1181287609b5d649f53ce6c146',1,'Codec(Global Namespace)']]], + ['codec_810',['codec',['https://docs.opencv.org/4.2.0/d8/db6/structcv_1_1cudacodec_1_1FormatInfo.html#aa43606fe19ccfc8f9bc98a92377fd999',1,'cv::cudacodec::FormatInfo']]], + ['codecs_811',['Codecs',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a9104e3711964b4e7723bab15987f41b9',1,'cv']]], + ['codecvt_812',['codecvt',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05199.html',1,'std::codecvt< _InternT, _ExternT, _StateT >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00056.html',1,'(Global Namespace)']]], + ['codecvt_2eh_813',['codecvt.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00305.html',1,'']]], + ['codecvt_3c_20_5felem_2c_20char_2c_20mbstate_5ft_20_3e_814',['codecvt< _Elem, char, mbstate_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05199.html',1,'']]], + ['codecvt_3c_20_5finternt_2c_20_5fexternt_2c_20encoding_5fstate_20_3e_815',['codecvt< _InternT, _ExternT, encoding_state >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10335.html',1,'std']]], + ['codecvt_3c_20char_2c_20char_2c_20mbstate_5ft_20_3e_816',['codecvt< char, char, mbstate_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05203.html',1,'std']]], + ['codecvt_3c_20char16_5ft_2c_20char_2c_20mbstate_5ft_20_3e_817',['codecvt< char16_t, char, mbstate_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05211.html',1,'std']]], + ['codecvt_3c_20char32_5ft_2c_20char_2c_20mbstate_5ft_20_3e_818',['codecvt< char32_t, char, mbstate_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05215.html',1,'std']]], + ['codecvt_3c_20wchar_5ft_2c_20char_2c_20mbstate_5ft_20_3e_819',['codecvt< wchar_t, char, mbstate_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05207.html',1,'std']]], + ['codecvt_5fbase_820',['codecvt_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05191.html',1,'std']]], + ['codecvt_5fbyname_821',['codecvt_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05219.html',1,'std']]], + ['codecvt_5fspecializations_2eh_822',['codecvt_specializations.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01040.html',1,'']]], + ['coef_823',['COEF',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3ae7112825b482d70cf5f04bc571f86e57',1,'cv::ml::SVM']]], + ['coef_824',['coef',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#ac755378bf8f25e6340d5c0d690d93cb1',1,'cv::optflow::GPCTree::Node']]], + ['coeff_825',['coeff',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Eigen::Array::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Eigen::Array::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< double, DPARM_SIZE, 1 >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< double, DPARM_SIZE, 1 >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< double, UMFPACK_CONTROL, 1 >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< double, UMFPACK_CONTROL, 1 >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< double, UMFPACK_INFO, 1 >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< double, UMFPACK_INFO, 1 >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< Index, 1, Dynamic >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< Index, 1, Dynamic >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< int, IPARM_SIZE, 1 >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< int, IPARM_SIZE, 1 >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< RealScalar, Dynamic, 1 >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< RealScalar, Dynamic, 1 >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< StorageIndex, 2, 1 >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< StorageIndex, 2, 1 >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac99d445913f04acc50280ae99dffd9c3',1,'Array< StorageIndex, 64, 1, DontAlign >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a954cd075bcd7babb429e3e4b9a418651',1,'Array< StorageIndex, 64, 1, DontAlign >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#aa7231d519967c37b4f98002d80756bda',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#af51b00cc45490ad698239ab6a8b94393',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::coeff(Index row, Index col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#aea142bb9ac9aa1b8c6b44f413daa4b88',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a6d8ebb28996655c441d5d744ac227c8d',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'Eigen::PlainObjectBase::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'Eigen::PlainObjectBase::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac99d445913f04acc50280ae99dffd9c3',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a954cd075bcd7babb429e3e4b9a418651',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeff(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#aa4e1f964b34c76697bcdd3b54b84d814',1,'Eigen::SelfAdjointView::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#aa4e1f964b34c76697bcdd3b54b84d814',1,'SelfAdjointView< const Derived, UpLo >::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a195e66f79171f78cc22d91fff37e36e3',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a54adf6aa526045f37e67e352da8fd105',1,'Eigen::SparseMatrix::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a54adf6aa526045f37e67e352da8fd105',1,'SparseMatrix< Scalar >::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a54adf6aa526045f37e67e352da8fd105',1,'SparseMatrix< Scalar, ColMajor, int >::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a54adf6aa526045f37e67e352da8fd105',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a54adf6aa526045f37e67e352da8fd105',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::coeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a51093bbf9d6c6bad6a8afee9c93d4b3f',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::coeff()']]], + ['coefficient_20wise_20math_20functions_826',['Catalog of coefficient-wise math functions',['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'']]], + ['coefficient_20wise_20operations_827',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], + ['coeffobjectsizetotrack_828',['coeffObjectSizeToTrack',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a9687dc16c686bfa924b8f81672f07f5d',1,'cv::DetectionBasedTracker::InnerParameters']]], + ['coeffobjectspeedusinginprediction_829',['coeffObjectSpeedUsingInPrediction',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a7967591810eabddc5ecb13f28a45f213',1,'cv::DetectionBasedTracker::InnerParameters']]], + ['coeffref_830',['coeffRef',['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Eigen::Array::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Eigen::Array::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Eigen::Array::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Eigen::Array::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< double, DPARM_SIZE, 1 >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< double, DPARM_SIZE, 1 >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< double, DPARM_SIZE, 1 >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< double, DPARM_SIZE, 1 >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< double, UMFPACK_CONTROL, 1 >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< double, UMFPACK_CONTROL, 1 >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< double, UMFPACK_CONTROL, 1 >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< double, UMFPACK_CONTROL, 1 >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< double, UMFPACK_INFO, 1 >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< double, UMFPACK_INFO, 1 >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< double, UMFPACK_INFO, 1 >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< double, UMFPACK_INFO, 1 >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< Index, 1, Dynamic >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< Index, 1, Dynamic >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< Index, 1, Dynamic >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< Index, 1, Dynamic >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< int, IPARM_SIZE, 1 >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< int, IPARM_SIZE, 1 >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< int, IPARM_SIZE, 1 >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< int, IPARM_SIZE, 1 >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< RealScalar, Dynamic, 1 >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< RealScalar, Dynamic, 1 >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< RealScalar, Dynamic, 1 >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< RealScalar, Dynamic, 1 >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< StorageIndex, 2, 1 >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< StorageIndex, 2, 1 >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< StorageIndex, 2, 1 >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< StorageIndex, 2, 1 >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Array< StorageIndex, 64, 1, DontAlign >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a541526a4f452554785e78bc41287b348',1,'Array< StorageIndex, 64, 1, DontAlign >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Array< StorageIndex, 64, 1, DontAlign >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a038a419ccb6e2c55593b27f17626fd62',1,'Array< StorageIndex, 64, 1, DontAlign >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#ae66b7d18b2a85f3139b703126974c900',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#adc8286576b31e11f056057be666a0ec8',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::coeffRef(Index row, Index col)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a474a755c6699eeeb9fd4fc70c502cdec',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#acaf91005e3230bbffe1c69a4199a0506',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'Eigen::PlainObjectBase::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'Eigen::PlainObjectBase::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'Eigen::PlainObjectBase::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'Eigen::PlainObjectBase::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a72e84dc1bb573ad8ecc9109fbbc1b63b',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a541526a4f452554785e78bc41287b348',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a992d58b5453e441dcfc80f21c2bfd1d7',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a038a419ccb6e2c55593b27f17626fd62',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::coeffRef(Index rowId, Index colId) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ab5b030515fcee3d1d4f84c0d9d13bd67',1,'Eigen::SelfAdjointView::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ab5b030515fcee3d1d4f84c0d9d13bd67',1,'SelfAdjointView< const Derived, UpLo >::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html#aa9c42d48b9dd6f947ce3c257fe4bf2ca',1,'Eigen::SparseMapBase< Derived, WriteAccessors >::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a013197b3f598968ff37ed8c97087f1ef',1,'Eigen::SparseMatrix::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a013197b3f598968ff37ed8c97087f1ef',1,'SparseMatrix< Scalar >::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a013197b3f598968ff37ed8c97087f1ef',1,'SparseMatrix< Scalar, ColMajor, int >::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a013197b3f598968ff37ed8c97087f1ef',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a013197b3f598968ff37ed8c97087f1ef',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#ad512e8e607f3c537b5e1836eea3502f9',1,'Eigen::SparseVector::coeffRef()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#afb8cc8b16f27fa263757506e818f3e7f',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::coeffRef()']]], + ['coeffs_831',['coeffs',['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ab484a0fbbb43e22812b6211d878cddd4',1,'Eigen::Hyperplane::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a4a051414928ebb5803036b69aad597ca',1,'Eigen::Hyperplane::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ae61294790c0cc308d3f69690a657672c',1,'Eigen::QuaternionBase::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a193e79f616335a0067e3e784c7cf85fa',1,'Eigen::QuaternionBase::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ae61294790c0cc308d3f69690a657672c',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a193e79f616335a0067e3e784c7cf85fa',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ae61294790c0cc308d3f69690a657672c',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a193e79f616335a0067e3e784c7cf85fa',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ae61294790c0cc308d3f69690a657672c',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a193e79f616335a0067e3e784c7cf85fa',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'Eigen::SparseCompressedBase::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'Eigen::SparseCompressedBase::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< Derived >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< Derived >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::coeffs() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#aff03e28a4bb93cd473d12452906065c2',1,'SparseCompressedBase< Transpose< MatrixType > >::coeffs()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a9cb41e40b43f7dbe6fd8b3e9e3755172',1,'SparseCompressedBase< Transpose< MatrixType > >::coeffs() const']]], + ['coefftrackingwindowsize_832',['coeffTrackingWindowSize',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a9fabef7efb531ebe2f0ba9d2ff06a253',1,'cv::DetectionBasedTracker::InnerParameters']]], + ['coeffvectortype_833',['CoeffVectorType',['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a567f99f3770365777b67bf9832b6fac1',1,'Eigen::HessenbergDecomposition::CoeffVectorType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a567f99f3770365777b67bf9832b6fac1',1,'HessenbergDecomposition< MatrixType >::CoeffVectorType']]], + ['col_834',['col',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#aac2b18c2ef3fbefc6f776cc313b966c0',1,'cv::cuda::GpuMat::col()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a6df72dc4291483b4c93251782abe2445',1,'cv::cudev::GpuMat_::col()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a23df02a07ffbfa4aa59c19bc003919fe',1,'cv::Mat::col()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a969438335ef8bb3da5232322e564d62b',1,'cv::Mat_::col()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a969438335ef8bb3da5232322e564d62b',1,'Mat_< double >::col()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a969438335ef8bb3da5232322e564d62b',1,'Mat_< float >::col()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a969438335ef8bb3da5232322e564d62b',1,'Mat_< uchar >::col()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a969438335ef8bb3da5232322e564d62b',1,'Mat_< unsigned char >::col()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae4aa2d04c89fa48df8d07913d897d7f9',1,'cv::MatExpr::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'cv::Matx::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< _Tp, cn, 1 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, 1, 3 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, 2, 2 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, 2, 3 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, 3, 3 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, 3, 4 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, 4, 4 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< double, cn, 1 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< float, 2, 3 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< float, 3, 3 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< float, cn, 1 >::col()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7291adaf84ce172b2ac2f4211aa296fc',1,'Matx< float_type, 4, 4 >::col()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aaaa4b7216656ea35c63fcfc745c6995c',1,'cv::UMat::col()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Triplet.html#a3531e3e2098507a069a368d72d46471e',1,'Eigen::Triplet::col()']]], + ['col_5fsample_835',['COL_SAMPLE',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gga9c57a2b823008dda53d2c7f7059a8710a5c76025220c9a8f5dbd2e0e49783b214',1,'cv::ml::COL_SAMPLE'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gga9c57a2b823008dda53d2c7f7059a8710a5c76025220c9a8f5dbd2e0e49783b214',1,'COL_SAMPLE(Global Namespace)']]], + ['colamdordering_836',['COLAMDOrdering',['https://eigen.tuxfamily.org/dox/classEigen_1_1COLAMDOrdering.html',1,'Eigen']]], + ['colindices_837',['colIndices',['https://eigen.tuxfamily.org/dox/classEigen_1_1IndexedView.html#ae4abc26fe04506a02d49e704e112f5bf',1,'Eigen::IndexedView']]], + ['collate_838',['collate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html',1,'std::collate< _CharT >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#acd2238d0ec6436541c1f9f343e5e32d3',1,'std::locale::collate'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#af79f640413431b317d0eef470792ebb3',1,'std::collate::collate(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a4c34c192809a224b1dfc6f3d6160e564',1,'std::collate::collate(__c_locale __cloc, size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a9a757dec2b2f903771da2427c292804a',1,'std::regex_constants::collate']]], + ['collate_5fbyname_839',['collate_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05899.html',1,'std']]], + ['collect_840',['collect',['https://docs.opencv.org/4.2.0/da/d6a/classcv_1_1face_1_1PredictCollector.html#ad67d7395e28845ee91be806ea093c4cd',1,'cv::face::PredictCollector::collect()'],['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#a685d8ba4a5541761fa252d99a36e6e33',1,'cv::face::StandardCollector::collect()']]], + ['collectgarbage_841',['collectGarbage',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a989f6582dd4c9789227405caa162e9b1',1,'cv::ximgproc::AdaptiveManifoldFilter::collectGarbage()'],['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#a6afb2a8465940e5ae46bfd0265132f3b',1,'cv::detail::BestOf2NearestMatcher::collectGarbage()'],['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1CLAHE.html#acfabd6cd7e533ddd11fa5b3591c07286',1,'cv::CLAHE::collectGarbage()'],['https://docs.opencv.org/4.2.0/df/dde/classcv_1_1DenseOpticalFlow.html#ada50da5295433ded930ddf32f681b80e',1,'cv::DenseOpticalFlow::collectGarbage()'],['https://docs.opencv.org/4.2.0/d1/d21/classcv_1_1superres_1_1DenseOpticalFlowExt.html#a5fbdddf5e0a27cf397794609da14a440',1,'cv::superres::DenseOpticalFlowExt::collectGarbage()'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a8520ff70e51e0bb138891ce410abf6e4',1,'cv::detail::FeaturesMatcher::collectGarbage()'],['https://docs.opencv.org/4.2.0/d5/d26/classcv_1_1cuda_1_1NvidiaHWOpticalFlow.html#a7b7679538d49adb53d614e63818275d6',1,'cv::cuda::NvidiaHWOpticalFlow::collectGarbage()'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#a20e30a8e3c15feb41f6db653c5b9f140',1,'cv::optflow::OpticalFlowPCAFlow::collectGarbage()'],['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#ac37de1a8bab83e86b3a540612dc2db1d',1,'cv::superres::SuperResolution::collectGarbage()']]], + ['collides_842',['collides',['../namespaceutil.html#a02e16f63251e3c2a45a1d6a2bde6b21a',1,'util']]], + ['colmajor_843',['ColMajor',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13a0103672ae41005ab03b4176c765afd62',1,'Eigen::ColMajor'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13a0103672ae41005ab03b4176c765afd62',1,'ColMajor(Global Namespace)']]], + ['color_844',['COLOR',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a6ce104a17b48a0503ccdcf4787ba2ef3aa9485acd73bb7982e3b2d853d6b12947',1,'cv::detail::DpSeamFinder']]], + ['color_845',['Color',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html',1,'cv::viz::Color'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#aba7de64923e52365d94def373007ae50',1,'cv::viz::Viz3d::Color'],['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a56ea927fa87f33b34bd96edbebf155b3',1,'cv::viz::Color::Color()'],['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a59c0626777297c2c854cfa8129c911fc',1,'cv::viz::Color::Color(double gray)'],['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a76aa939614074556af659295fa87a02a',1,'cv::viz::Color::Color(double blue, double green, double red)'],['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a3200c2af3a4a34e87ea1431fd8af4320',1,'cv::viz::Color::Color(const Scalar &color)']]], + ['color_846',['color',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#a4e6d015bea8d7ea6c654ffebdbcb6a6e',1,'cv::gapi::wip::draw::Circle::color'],['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#a215bf1579794eb17360d5eb9ccae68c4',1,'cv::gapi::wip::draw::FText::color'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1gapi_1_1wip_1_1draw_1_1Line.html#a37ee00e2e9bb1925dd725eadd080a776',1,'cv::gapi::wip::draw::Line::color'],['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#a00a13eaa745f446dd1eb42c15eb129a1',1,'cv::gapi::wip::draw::Poly::color'],['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a87c73b5094c4884e93c4a20a0691ac97',1,'cv::QtFont::color'],['https://docs.opencv.org/4.2.0/d6/d30/structcv_1_1gapi_1_1wip_1_1draw_1_1Rect.html#a8b3cefcaa0903dde4db0722e0ec15b63',1,'cv::gapi::wip::draw::Rect::color'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a766270fb50948f67ae1cc47348c29786',1,'cv::gapi::wip::draw::Text::color']]], + ['color_20conversions_847',['Color conversions',['https://docs.opencv.org/4.2.0/de/d25/imgproc_color_conversions.html',1,'']]], + ['color_20palette_848',['Trackbar as the Color Palette',['https://docs.opencv.org/4.2.0/d9/dc8/tutorial_py_trackbar.html',1,'']]], + ['color_20space_20conversions_849',['Color Space Conversions',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html',1,'']]], + ['color_20space_20processing_850',['Color space processing',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html',1,'']]], + ['color_20space_20to_20another_851',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], + ['color_2ehpp_852',['color.hpp',['https://docs.opencv.org/4.2.0/d1/d71/modules_2core_2include_2opencv2_2core_2cuda_2color_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d7a/contrib_2modules_2cudev_2include_2opencv2_2cudev_2expr_2color_8hpp.html',1,'(Global Namespace)']]], + ['color_5fbayerbg2bgr_853',['COLOR_BayerBG2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8945844ab075687f4d4196abe1ce0db4',1,'cv::COLOR_BayerBG2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8945844ab075687f4d4196abe1ce0db4',1,'COLOR_BayerBG2BGR(Global Namespace)']]], + ['color_5fbayerbg2bgr_5fea_854',['COLOR_BayerBG2BGR_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af945cf163b1b5d01b69feabfe10d62bc',1,'cv::COLOR_BayerBG2BGR_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af945cf163b1b5d01b69feabfe10d62bc',1,'COLOR_BayerBG2BGR_EA(Global Namespace)']]], + ['color_5fbayerbg2bgr_5fmht_855',['COLOR_BayerBG2BGR_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9addf009a20751e8b5e3f35e0a6e6a6494',1,'cv::cuda::COLOR_BayerBG2BGR_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9addf009a20751e8b5e3f35e0a6e6a6494',1,'COLOR_BayerBG2BGR_MHT(Global Namespace)']]], + ['color_5fbayerbg2bgr_5fvng_856',['COLOR_BayerBG2BGR_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a03fa881afa10795e9f4344a50b80db7f',1,'cv::COLOR_BayerBG2BGR_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a03fa881afa10795e9f4344a50b80db7f',1,'COLOR_BayerBG2BGR_VNG(Global Namespace)']]], + ['color_5fbayerbg2bgra_857',['COLOR_BayerBG2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a64d2dcd6fd8f41e865801fda7a2b75e4',1,'cv::COLOR_BayerBG2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a64d2dcd6fd8f41e865801fda7a2b75e4',1,'COLOR_BayerBG2BGRA(Global Namespace)']]], + ['color_5fbayerbg2gray_858',['COLOR_BayerBG2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a08febd33b0214417dd33a7fb014bf99a',1,'cv::COLOR_BayerBG2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a08febd33b0214417dd33a7fb014bf99a',1,'COLOR_BayerBG2GRAY(Global Namespace)']]], + ['color_5fbayerbg2gray_5fmht_859',['COLOR_BayerBG2GRAY_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9aad9130613cf3bbd1c139eed3ce964602',1,'cv::cuda::COLOR_BayerBG2GRAY_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9aad9130613cf3bbd1c139eed3ce964602',1,'COLOR_BayerBG2GRAY_MHT(Global Namespace)']]], + ['color_5fbayerbg2rgb_860',['COLOR_BayerBG2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abb38ecd5317747c872d3775196abe142',1,'cv::COLOR_BayerBG2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abb38ecd5317747c872d3775196abe142',1,'COLOR_BayerBG2RGB(Global Namespace)']]], + ['color_5fbayerbg2rgb_5fea_861',['COLOR_BayerBG2RGB_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad9c5f421182bb1c1fccf50de67c84686',1,'cv::COLOR_BayerBG2RGB_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad9c5f421182bb1c1fccf50de67c84686',1,'COLOR_BayerBG2RGB_EA(Global Namespace)']]], + ['color_5fbayerbg2rgb_5fmht_862',['COLOR_BayerBG2RGB_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a954a78abfff350f7df5c9d4924c10bef',1,'cv::cuda::COLOR_BayerBG2RGB_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a954a78abfff350f7df5c9d4924c10bef',1,'COLOR_BayerBG2RGB_MHT(Global Namespace)']]], + ['color_5fbayerbg2rgb_5fvng_863',['COLOR_BayerBG2RGB_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a212329fc4bd4fbbad13243d1ac2251f2',1,'cv::COLOR_BayerBG2RGB_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a212329fc4bd4fbbad13243d1ac2251f2',1,'COLOR_BayerBG2RGB_VNG(Global Namespace)']]], + ['color_5fbayerbg2rgba_864',['COLOR_BayerBG2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae80c95f834b3b7038ba2facf544b0d9b',1,'cv::COLOR_BayerBG2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae80c95f834b3b7038ba2facf544b0d9b',1,'COLOR_BayerBG2RGBA(Global Namespace)']]], + ['color_5fbayergb2bgr_865',['COLOR_BayerGB2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acef801137d9696dcb622122a7ef266c6',1,'cv::COLOR_BayerGB2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acef801137d9696dcb622122a7ef266c6',1,'COLOR_BayerGB2BGR(Global Namespace)']]], + ['color_5fbayergb2bgr_5fea_866',['COLOR_BayerGB2BGR_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3ac0015fd225d6e02485c822fb26b4b6',1,'cv::COLOR_BayerGB2BGR_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3ac0015fd225d6e02485c822fb26b4b6',1,'COLOR_BayerGB2BGR_EA(Global Namespace)']]], + ['color_5fbayergb2bgr_5fmht_867',['COLOR_BayerGB2BGR_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9ae7ed117e179385954505a127492a3f71',1,'cv::cuda::COLOR_BayerGB2BGR_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9ae7ed117e179385954505a127492a3f71',1,'COLOR_BayerGB2BGR_MHT(Global Namespace)']]], + ['color_5fbayergb2bgr_5fvng_868',['COLOR_BayerGB2BGR_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae47bd67001d93fbee5638f61ce256b68',1,'cv::COLOR_BayerGB2BGR_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae47bd67001d93fbee5638f61ce256b68',1,'COLOR_BayerGB2BGR_VNG(Global Namespace)']]], + ['color_5fbayergb2bgra_869',['COLOR_BayerGB2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ace94e0ec556c55476cd451fbcd411bb8',1,'cv::COLOR_BayerGB2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ace94e0ec556c55476cd451fbcd411bb8',1,'COLOR_BayerGB2BGRA(Global Namespace)']]], + ['color_5fbayergb2gray_870',['COLOR_BayerGB2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a63667769d13ad6dff2b5a296f4c966d2',1,'cv::COLOR_BayerGB2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a63667769d13ad6dff2b5a296f4c966d2',1,'COLOR_BayerGB2GRAY(Global Namespace)']]], + ['color_5fbayergb2gray_5fmht_871',['COLOR_BayerGB2GRAY_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a3b7d66377d5b0265d5f0bb5f3ca5b8bc',1,'cv::cuda::COLOR_BayerGB2GRAY_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a3b7d66377d5b0265d5f0bb5f3ca5b8bc',1,'COLOR_BayerGB2GRAY_MHT(Global Namespace)']]], + ['color_5fbayergb2rgb_872',['COLOR_BayerGB2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a93f007ad1b8f904f6e8c54dd8ccd4049',1,'cv::COLOR_BayerGB2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a93f007ad1b8f904f6e8c54dd8ccd4049',1,'COLOR_BayerGB2RGB(Global Namespace)']]], + ['color_5fbayergb2rgb_5fea_873',['COLOR_BayerGB2RGB_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2592253337e4790bf01bad9e0eee5619',1,'cv::COLOR_BayerGB2RGB_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2592253337e4790bf01bad9e0eee5619',1,'COLOR_BayerGB2RGB_EA(Global Namespace)']]], + ['color_5fbayergb2rgb_5fmht_874',['COLOR_BayerGB2RGB_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a0846825de742426ac98e8342496e4f71',1,'cv::cuda::COLOR_BayerGB2RGB_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a0846825de742426ac98e8342496e4f71',1,'COLOR_BayerGB2RGB_MHT(Global Namespace)']]], + ['color_5fbayergb2rgb_5fvng_875',['COLOR_BayerGB2RGB_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae80631e50e83917297c2ff2c328da841',1,'cv::COLOR_BayerGB2RGB_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae80631e50e83917297c2ff2c328da841',1,'COLOR_BayerGB2RGB_VNG(Global Namespace)']]], + ['color_5fbayergb2rgba_876',['COLOR_BayerGB2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7c7aab61b00caa7099a2e008db0ff083',1,'cv::COLOR_BayerGB2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7c7aab61b00caa7099a2e008db0ff083',1,'COLOR_BayerGB2RGBA(Global Namespace)']]], + ['color_5fbayergr2bgr_877',['COLOR_BayerGR2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afe3d71ad80f5f067d3d76b376cf8d951',1,'cv::COLOR_BayerGR2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afe3d71ad80f5f067d3d76b376cf8d951',1,'COLOR_BayerGR2BGR(Global Namespace)']]], + ['color_5fbayergr2bgr_5fea_878',['COLOR_BayerGR2BGR_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af51a3d5aceb2256a59c3a4c8e499d7e3',1,'cv::COLOR_BayerGR2BGR_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af51a3d5aceb2256a59c3a4c8e499d7e3',1,'COLOR_BayerGR2BGR_EA(Global Namespace)']]], + ['color_5fbayergr2bgr_5fmht_879',['COLOR_BayerGR2BGR_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a370dd60e4d1fe51c51a5a90d250ac8b1',1,'cv::cuda::COLOR_BayerGR2BGR_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a370dd60e4d1fe51c51a5a90d250ac8b1',1,'COLOR_BayerGR2BGR_MHT(Global Namespace)']]], + ['color_5fbayergr2bgr_5fvng_880',['COLOR_BayerGR2BGR_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad787e2911c5b21eaf4d7ffe6f85ad5a8',1,'cv::COLOR_BayerGR2BGR_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad787e2911c5b21eaf4d7ffe6f85ad5a8',1,'COLOR_BayerGR2BGR_VNG(Global Namespace)']]], + ['color_5fbayergr2bgra_881',['COLOR_BayerGR2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a850bc919c36bb360f1270ffb9f839532',1,'cv::COLOR_BayerGR2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a850bc919c36bb360f1270ffb9f839532',1,'COLOR_BayerGR2BGRA(Global Namespace)']]], + ['color_5fbayergr2gray_882',['COLOR_BayerGR2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aaab526ce2ad4ce74603c711b3c22a38a',1,'cv::COLOR_BayerGR2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aaab526ce2ad4ce74603c711b3c22a38a',1,'COLOR_BayerGR2GRAY(Global Namespace)']]], + ['color_5fbayergr2gray_5fmht_883',['COLOR_BayerGR2GRAY_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a401bb8e159ec835ee3dd035a1af473b9',1,'cv::cuda::COLOR_BayerGR2GRAY_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a401bb8e159ec835ee3dd035a1af473b9',1,'COLOR_BayerGR2GRAY_MHT(Global Namespace)']]], + ['color_5fbayergr2rgb_884',['COLOR_BayerGR2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aac8c643ccf0c9d9407bd0cb9a18520d2',1,'cv::COLOR_BayerGR2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aac8c643ccf0c9d9407bd0cb9a18520d2',1,'COLOR_BayerGR2RGB(Global Namespace)']]], + ['color_5fbayergr2rgb_5fea_885',['COLOR_BayerGR2RGB_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af6c182db5d5c2bc25a349caeb02ee59e',1,'cv::COLOR_BayerGR2RGB_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af6c182db5d5c2bc25a349caeb02ee59e',1,'COLOR_BayerGR2RGB_EA(Global Namespace)']]], + ['color_5fbayergr2rgb_5fmht_886',['COLOR_BayerGR2RGB_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a344694fbc10ea8ba9c6f18c220d91174',1,'cv::cuda::COLOR_BayerGR2RGB_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a344694fbc10ea8ba9c6f18c220d91174',1,'COLOR_BayerGR2RGB_MHT(Global Namespace)']]], + ['color_5fbayergr2rgb_5fvng_887',['COLOR_BayerGR2RGB_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ace5b476881d97cb22627eb333c9655d6',1,'cv::COLOR_BayerGR2RGB_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ace5b476881d97cb22627eb333c9655d6',1,'COLOR_BayerGR2RGB_VNG(Global Namespace)']]], + ['color_5fbayergr2rgba_888',['COLOR_BayerGR2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7dfeef02dd5d9d7b907e3aece0e87098',1,'cv::COLOR_BayerGR2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7dfeef02dd5d9d7b907e3aece0e87098',1,'COLOR_BayerGR2RGBA(Global Namespace)']]], + ['color_5fbayerrg2bgr_889',['COLOR_BayerRG2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a275d4d0ff99fdf45b2b6b421a14ec831',1,'cv::COLOR_BayerRG2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a275d4d0ff99fdf45b2b6b421a14ec831',1,'COLOR_BayerRG2BGR(Global Namespace)']]], + ['color_5fbayerrg2bgr_5fea_890',['COLOR_BayerRG2BGR_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a9a7ff84cd856119c6c5b8ecb81ba9284',1,'cv::COLOR_BayerRG2BGR_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a9a7ff84cd856119c6c5b8ecb81ba9284',1,'COLOR_BayerRG2BGR_EA(Global Namespace)']]], + ['color_5fbayerrg2bgr_5fmht_891',['COLOR_BayerRG2BGR_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a3539d4ab50d2386af8f4033e0a4aca7d',1,'cv::cuda::COLOR_BayerRG2BGR_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a3539d4ab50d2386af8f4033e0a4aca7d',1,'COLOR_BayerRG2BGR_MHT(Global Namespace)']]], + ['color_5fbayerrg2bgr_5fvng_892',['COLOR_BayerRG2BGR_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad298bb184eda5bf3a58fbc4e509c0e43',1,'cv::COLOR_BayerRG2BGR_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad298bb184eda5bf3a58fbc4e509c0e43',1,'COLOR_BayerRG2BGR_VNG(Global Namespace)']]], + ['color_5fbayerrg2bgra_893',['COLOR_BayerRG2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af3d528d5f0f7c24ac08dd5e5a8f19ddc',1,'cv::COLOR_BayerRG2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af3d528d5f0f7c24ac08dd5e5a8f19ddc',1,'COLOR_BayerRG2BGRA(Global Namespace)']]], + ['color_5fbayerrg2gray_894',['COLOR_BayerRG2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad4fbbce0080be39beb5397716bac3ccc',1,'cv::COLOR_BayerRG2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad4fbbce0080be39beb5397716bac3ccc',1,'COLOR_BayerRG2GRAY(Global Namespace)']]], + ['color_5fbayerrg2gray_5fmht_895',['COLOR_BayerRG2GRAY_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a6e63778d3e4aa13d21aa74a8124e2afb',1,'cv::cuda::COLOR_BayerRG2GRAY_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9a6e63778d3e4aa13d21aa74a8124e2afb',1,'COLOR_BayerRG2GRAY_MHT(Global Namespace)']]], + ['color_5fbayerrg2rgb_896',['COLOR_BayerRG2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ade83fb9a89e974207e5fef472f28adf3',1,'cv::COLOR_BayerRG2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ade83fb9a89e974207e5fef472f28adf3',1,'COLOR_BayerRG2RGB(Global Namespace)']]], + ['color_5fbayerrg2rgb_5fea_897',['COLOR_BayerRG2RGB_EA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac71ff26b3666986f20fdc33e749a67a4',1,'cv::COLOR_BayerRG2RGB_EA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac71ff26b3666986f20fdc33e749a67a4',1,'COLOR_BayerRG2RGB_EA(Global Namespace)']]], + ['color_5fbayerrg2rgb_5fmht_898',['COLOR_BayerRG2RGB_MHT',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9abd4996d237d3a632990d94db73385f74',1,'cv::cuda::COLOR_BayerRG2RGB_MHT'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ggaa9e40b798350356f45667e609d5d82f9abd4996d237d3a632990d94db73385f74',1,'COLOR_BayerRG2RGB_MHT(Global Namespace)']]], + ['color_5fbayerrg2rgb_5fvng_899',['COLOR_BayerRG2RGB_VNG',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aafd52baa924f361873e0a0cec1cf9667',1,'cv::COLOR_BayerRG2RGB_VNG'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aafd52baa924f361873e0a0cec1cf9667',1,'COLOR_BayerRG2RGB_VNG(Global Namespace)']]], + ['color_5fbayerrg2rgba_900',['COLOR_BayerRG2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2a80354788f54d0bed59fa44ea2fb98e',1,'cv::COLOR_BayerRG2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2a80354788f54d0bed59fa44ea2fb98e',1,'COLOR_BayerRG2RGBA(Global Namespace)']]], + ['color_5fbgr2bgr555_901',['COLOR_BGR2BGR555',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acf67881c46eb58292f1591ba1378ced1',1,'cv::COLOR_BGR2BGR555'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acf67881c46eb58292f1591ba1378ced1',1,'COLOR_BGR2BGR555(Global Namespace)']]], + ['color_5fbgr2bgr565_902',['COLOR_BGR2BGR565',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae353073865366f7c70fcf584797f05df',1,'cv::COLOR_BGR2BGR565'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae353073865366f7c70fcf584797f05df',1,'COLOR_BGR2BGR565(Global Namespace)']]], + ['color_5fbgr2bgra_903',['COLOR_BGR2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a95d70bf0c1b5aa58d1eb8abf03161f21',1,'cv::COLOR_BGR2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a95d70bf0c1b5aa58d1eb8abf03161f21',1,'COLOR_BGR2BGRA(Global Namespace)']]], + ['color_5fbgr2gray_904',['COLOR_BGR2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a353a4b8db9040165db4dacb5bcefb6ea',1,'cv::COLOR_BGR2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a353a4b8db9040165db4dacb5bcefb6ea',1,'COLOR_BGR2GRAY(Global Namespace)']]], + ['color_5fbgr2hls_905',['COLOR_BGR2HLS',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3070ca753ff41d655e87315bee03d8af',1,'cv::COLOR_BGR2HLS'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3070ca753ff41d655e87315bee03d8af',1,'COLOR_BGR2HLS(Global Namespace)']]], + ['color_5fbgr2hls_5ffull_906',['COLOR_BGR2HLS_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae2cb61868a2157317f8c37fcd3e35a50',1,'cv::COLOR_BGR2HLS_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae2cb61868a2157317f8c37fcd3e35a50',1,'COLOR_BGR2HLS_FULL(Global Namespace)']]], + ['color_5fbgr2hsv_907',['COLOR_BGR2HSV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa4a7f0ecf2e94150699e48c79139ee12',1,'cv::COLOR_BGR2HSV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa4a7f0ecf2e94150699e48c79139ee12',1,'COLOR_BGR2HSV(Global Namespace)']]], + ['color_5fbgr2hsv_5ffull_908',['COLOR_BGR2HSV_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2dd48d4bc63904a55500a4ef5608f7e1',1,'cv::COLOR_BGR2HSV_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2dd48d4bc63904a55500a4ef5608f7e1',1,'COLOR_BGR2HSV_FULL(Global Namespace)']]], + ['color_5fbgr2lab_909',['COLOR_BGR2Lab',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a860b72b4741c431e81340fafef5eca24',1,'cv::COLOR_BGR2Lab'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a860b72b4741c431e81340fafef5eca24',1,'COLOR_BGR2Lab(Global Namespace)']]], + ['color_5fbgr2luv_910',['COLOR_BGR2Luv',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8199112edf021b1586c75ca20a46ecd1',1,'cv::COLOR_BGR2Luv'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8199112edf021b1586c75ca20a46ecd1',1,'COLOR_BGR2Luv(Global Namespace)']]], + ['color_5fbgr2rgb_911',['COLOR_BGR2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad3db9ff253b87d02efe4887b2f5d77ee',1,'cv::COLOR_BGR2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad3db9ff253b87d02efe4887b2f5d77ee',1,'COLOR_BGR2RGB(Global Namespace)']]], + ['color_5fbgr2rgba_912',['COLOR_BGR2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a9cef93380497571d867d18149c268ed1',1,'cv::COLOR_BGR2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a9cef93380497571d867d18149c268ed1',1,'COLOR_BGR2RGBA(Global Namespace)']]], + ['color_5fbgr2xyz_913',['COLOR_BGR2XYZ',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab3b3aba03d2e2a92fbd7564efd47e38b',1,'cv::COLOR_BGR2XYZ'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab3b3aba03d2e2a92fbd7564efd47e38b',1,'COLOR_BGR2XYZ(Global Namespace)']]], + ['color_5fbgr2ycrcb_914',['COLOR_BGR2YCrCb',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a63f063ef276a066c4e122997cfd55d6e',1,'cv::COLOR_BGR2YCrCb'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a63f063ef276a066c4e122997cfd55d6e',1,'COLOR_BGR2YCrCb(Global Namespace)']]], + ['color_5fbgr2yuv_915',['COLOR_BGR2YUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a611d58d4a431fdbc294b4c79701f3d1a',1,'cv::COLOR_BGR2YUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a611d58d4a431fdbc294b4c79701f3d1a',1,'COLOR_BGR2YUV(Global Namespace)']]], + ['color_5fbgr2yuv_5fi420_916',['COLOR_BGR2YUV_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae755aac1b6d7903bdc798f9246a0e47a',1,'cv::COLOR_BGR2YUV_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae755aac1b6d7903bdc798f9246a0e47a',1,'COLOR_BGR2YUV_I420(Global Namespace)']]], + ['color_5fbgr2yuv_5fiyuv_917',['COLOR_BGR2YUV_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae21fa301a150cb9bfb80eab5bdb0b547',1,'cv::COLOR_BGR2YUV_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae21fa301a150cb9bfb80eab5bdb0b547',1,'COLOR_BGR2YUV_IYUV(Global Namespace)']]], + ['color_5fbgr2yuv_5fyv12_918',['COLOR_BGR2YUV_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0affdc3f6b1d2e3161c2773ec67b9eec01',1,'cv::COLOR_BGR2YUV_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0affdc3f6b1d2e3161c2773ec67b9eec01',1,'COLOR_BGR2YUV_YV12(Global Namespace)']]], + ['color_5fbgr5552bgr_919',['COLOR_BGR5552BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab22ef0b60e63861795e13bca6ae9432f',1,'cv::COLOR_BGR5552BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab22ef0b60e63861795e13bca6ae9432f',1,'COLOR_BGR5552BGR(Global Namespace)']]], + ['color_5fbgr5552bgra_920',['COLOR_BGR5552BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a88bd4303c12c5de2885ad800af09db2e',1,'cv::COLOR_BGR5552BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a88bd4303c12c5de2885ad800af09db2e',1,'COLOR_BGR5552BGRA(Global Namespace)']]], + ['color_5fbgr5552gray_921',['COLOR_BGR5552GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4c826fdf9d60ae16488ffaa450f9ff5a',1,'cv::COLOR_BGR5552GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4c826fdf9d60ae16488ffaa450f9ff5a',1,'COLOR_BGR5552GRAY(Global Namespace)']]], + ['color_5fbgr5552rgb_922',['COLOR_BGR5552RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a76fa45576fa678e0fd6c562dfe7c52d2',1,'cv::COLOR_BGR5552RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a76fa45576fa678e0fd6c562dfe7c52d2',1,'COLOR_BGR5552RGB(Global Namespace)']]], + ['color_5fbgr5552rgba_923',['COLOR_BGR5552RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a80ca6a02328711a35c6ab1ea88f6d9ac',1,'cv::COLOR_BGR5552RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a80ca6a02328711a35c6ab1ea88f6d9ac',1,'COLOR_BGR5552RGBA(Global Namespace)']]], + ['color_5fbgr5652bgr_924',['COLOR_BGR5652BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af388d43f640a979fa93adf27f16973aa',1,'cv::COLOR_BGR5652BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af388d43f640a979fa93adf27f16973aa',1,'COLOR_BGR5652BGR(Global Namespace)']]], + ['color_5fbgr5652bgra_925',['COLOR_BGR5652BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a485bce6c1fe6a13a95157840bd572fa3',1,'cv::COLOR_BGR5652BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a485bce6c1fe6a13a95157840bd572fa3',1,'COLOR_BGR5652BGRA(Global Namespace)']]], + ['color_5fbgr5652gray_926',['COLOR_BGR5652GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a71cb89814fc07c4bff35bc374de239d9',1,'cv::COLOR_BGR5652GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a71cb89814fc07c4bff35bc374de239d9',1,'COLOR_BGR5652GRAY(Global Namespace)']]], + ['color_5fbgr5652rgb_927',['COLOR_BGR5652RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aba428b6099680ca449616b67bfa4d4dd',1,'cv::COLOR_BGR5652RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aba428b6099680ca449616b67bfa4d4dd',1,'COLOR_BGR5652RGB(Global Namespace)']]], + ['color_5fbgr5652rgba_928',['COLOR_BGR5652RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aae2022279d9c6435a081b7fb93dc42c4',1,'cv::COLOR_BGR5652RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aae2022279d9c6435a081b7fb93dc42c4',1,'COLOR_BGR5652RGBA(Global Namespace)']]], + ['color_5fbgra2bgr_929',['COLOR_BGRA2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3a7148dd1537f09d35b69690b0548798',1,'cv::COLOR_BGRA2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3a7148dd1537f09d35b69690b0548798',1,'COLOR_BGRA2BGR(Global Namespace)']]], + ['color_5fbgra2bgr555_930',['COLOR_BGRA2BGR555',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae4cb06b90fdec292979d0e0ec6d021c9',1,'cv::COLOR_BGRA2BGR555'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae4cb06b90fdec292979d0e0ec6d021c9',1,'COLOR_BGRA2BGR555(Global Namespace)']]], + ['color_5fbgra2bgr565_931',['COLOR_BGRA2BGR565',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aed987d3698f96dbfb162f95cff34deb1',1,'cv::COLOR_BGRA2BGR565'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aed987d3698f96dbfb162f95cff34deb1',1,'COLOR_BGRA2BGR565(Global Namespace)']]], + ['color_5fbgra2gray_932',['COLOR_BGRA2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af0b29b81ffc329681ad9388af7e76b01',1,'cv::COLOR_BGRA2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af0b29b81ffc329681ad9388af7e76b01',1,'COLOR_BGRA2GRAY(Global Namespace)']]], + ['color_5fbgra2rgb_933',['COLOR_BGRA2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a610c1faaa2c8b6065a9c84203d5da232',1,'cv::COLOR_BGRA2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a610c1faaa2c8b6065a9c84203d5da232',1,'COLOR_BGRA2RGB(Global Namespace)']]], + ['color_5fbgra2rgba_934',['COLOR_BGRA2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a06d2c61b23b77b9a3075388146ba5180',1,'cv::COLOR_BGRA2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a06d2c61b23b77b9a3075388146ba5180',1,'COLOR_BGRA2RGBA(Global Namespace)']]], + ['color_5fbgra2yuv_5fi420_935',['COLOR_BGRA2YUV_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae9c2defc5268f6c7938895b0f675df08',1,'cv::COLOR_BGRA2YUV_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae9c2defc5268f6c7938895b0f675df08',1,'COLOR_BGRA2YUV_I420(Global Namespace)']]], + ['color_5fbgra2yuv_5fiyuv_936',['COLOR_BGRA2YUV_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a64843a51caea1694321bd3a857aa35e3',1,'cv::COLOR_BGRA2YUV_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a64843a51caea1694321bd3a857aa35e3',1,'COLOR_BGRA2YUV_IYUV(Global Namespace)']]], + ['color_5fbgra2yuv_5fyv12_937',['COLOR_BGRA2YUV_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1b016fc90c37ba19b9bf41198a392eaa',1,'cv::COLOR_BGRA2YUV_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1b016fc90c37ba19b9bf41198a392eaa',1,'COLOR_BGRA2YUV_YV12(Global Namespace)']]], + ['color_5fcolorcvt_5fmax_938',['COLOR_COLORCVT_MAX',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a926d8b1b6943881b205f76fc14cdf244',1,'cv::COLOR_COLORCVT_MAX'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a926d8b1b6943881b205f76fc14cdf244',1,'COLOR_COLORCVT_MAX(Global Namespace)']]], + ['color_5fcvt_2ehpp_939',['color_cvt.hpp',['https://docs.opencv.org/4.2.0/db/dcf/color__cvt_8hpp.html',1,'']]], + ['color_5fgrad_940',['COLOR_GRAD',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a6ce104a17b48a0503ccdcf4787ba2ef3a306cd9d1479580c01f8d2ffa5328917b',1,'cv::detail::DpSeamFinder']]], + ['color_5fgray2bgr_941',['COLOR_GRAY2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a869da65c045477f2f17d39395df65b2d',1,'cv::COLOR_GRAY2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a869da65c045477f2f17d39395df65b2d',1,'COLOR_GRAY2BGR(Global Namespace)']]], + ['color_5fgray2bgr555_942',['COLOR_GRAY2BGR555',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a739351593dfc5c3917e4b39fe4f12e0f',1,'cv::COLOR_GRAY2BGR555'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a739351593dfc5c3917e4b39fe4f12e0f',1,'COLOR_GRAY2BGR555(Global Namespace)']]], + ['color_5fgray2bgr565_943',['COLOR_GRAY2BGR565',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a898758d335300e306c66f1bfc3cc6aab',1,'cv::COLOR_GRAY2BGR565'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a898758d335300e306c66f1bfc3cc6aab',1,'COLOR_GRAY2BGR565(Global Namespace)']]], + ['color_5fgray2bgra_944',['COLOR_GRAY2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acab34eea440d5a100e82141f86d29f5f',1,'cv::COLOR_GRAY2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acab34eea440d5a100e82141f86d29f5f',1,'COLOR_GRAY2BGRA(Global Namespace)']]], + ['color_5fgray2rgb_945',['COLOR_GRAY2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a164663625b9c473f69dd47cdd7a31acc',1,'cv::COLOR_GRAY2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a164663625b9c473f69dd47cdd7a31acc',1,'COLOR_GRAY2RGB(Global Namespace)']]], + ['color_5fgray2rgba_946',['COLOR_GRAY2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aecc1b054bb042ee91478e591cf1f19b8',1,'cv::COLOR_GRAY2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aecc1b054bb042ee91478e591cf1f19b8',1,'COLOR_GRAY2RGBA(Global Namespace)']]], + ['color_5fhls2bgr_947',['COLOR_HLS2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1dc9f081ce5202ade309e319414c14cd',1,'cv::COLOR_HLS2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1dc9f081ce5202ade309e319414c14cd',1,'COLOR_HLS2BGR(Global Namespace)']]], + ['color_5fhls2bgr_5ffull_948',['COLOR_HLS2BGR_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a74b8be5439286eb365360c3af65bd938',1,'cv::COLOR_HLS2BGR_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a74b8be5439286eb365360c3af65bd938',1,'COLOR_HLS2BGR_FULL(Global Namespace)']]], + ['color_5fhls2rgb_949',['COLOR_HLS2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a501d0d119ebbf50ddbbf3743f2783aca',1,'cv::COLOR_HLS2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a501d0d119ebbf50ddbbf3743f2783aca',1,'COLOR_HLS2RGB(Global Namespace)']]], + ['color_5fhls2rgb_5ffull_950',['COLOR_HLS2RGB_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a5bb4b7196825e755f6f6eb99653c2dd5',1,'cv::COLOR_HLS2RGB_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a5bb4b7196825e755f6f6eb99653c2dd5',1,'COLOR_HLS2RGB_FULL(Global Namespace)']]], + ['color_5fhsv2bgr_951',['COLOR_HSV2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2a4b11ff7d29c342b66b85962a7969cd',1,'cv::COLOR_HSV2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2a4b11ff7d29c342b66b85962a7969cd',1,'COLOR_HSV2BGR(Global Namespace)']]], + ['color_5fhsv2bgr_5ffull_952',['COLOR_HSV2BGR_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a752b22a2fc75d74d504db1102357d784',1,'cv::COLOR_HSV2BGR_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a752b22a2fc75d74d504db1102357d784',1,'COLOR_HSV2BGR_FULL(Global Namespace)']]], + ['color_5fhsv2rgb_953',['COLOR_HSV2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a348965e2c1baf8e2c78c9afc17ac3de2',1,'cv::COLOR_HSV2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a348965e2c1baf8e2c78c9afc17ac3de2',1,'COLOR_HSV2RGB(Global Namespace)']]], + ['color_5fhsv2rgb_5ffull_954',['COLOR_HSV2RGB_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a995659971a31fad980de36ca00e14f3e',1,'cv::COLOR_HSV2RGB_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a995659971a31fad980de36ca00e14f3e',1,'COLOR_HSV2RGB_FULL(Global Namespace)']]], + ['color_5flab2bgr_955',['COLOR_Lab2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a966fd47d10ad71c4220b3ef9f1ac5774',1,'cv::COLOR_Lab2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a966fd47d10ad71c4220b3ef9f1ac5774',1,'COLOR_Lab2BGR(Global Namespace)']]], + ['color_5flab2lbgr_956',['COLOR_Lab2LBGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa29be3cb6dcbe7e33e7a0cf93bda4ce5',1,'cv::COLOR_Lab2LBGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa29be3cb6dcbe7e33e7a0cf93bda4ce5',1,'COLOR_Lab2LBGR(Global Namespace)']]], + ['color_5flab2lrgb_957',['COLOR_Lab2LRGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0ed4c859218edf4a60dc11c0c283ae37',1,'cv::COLOR_Lab2LRGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0ed4c859218edf4a60dc11c0c283ae37',1,'COLOR_Lab2LRGB(Global Namespace)']]], + ['color_5flab2rgb_958',['COLOR_Lab2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a50988b0e1e8369628a55cc8860dfbf69',1,'cv::COLOR_Lab2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a50988b0e1e8369628a55cc8860dfbf69',1,'COLOR_Lab2RGB(Global Namespace)']]], + ['color_5flbgr2lab_959',['COLOR_LBGR2Lab',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa8e6dba26491ccf877a10a050db34627',1,'cv::COLOR_LBGR2Lab'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa8e6dba26491ccf877a10a050db34627',1,'COLOR_LBGR2Lab(Global Namespace)']]], + ['color_5flbgr2luv_960',['COLOR_LBGR2Luv',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1dac1906d1b5a04822e55ce6b8f236ec',1,'cv::COLOR_LBGR2Luv'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1dac1906d1b5a04822e55ce6b8f236ec',1,'COLOR_LBGR2Luv(Global Namespace)']]], + ['color_5flrgb2lab_961',['COLOR_LRGB2Lab',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a91c5ba94272235045f917e1ca06ac695',1,'cv::COLOR_LRGB2Lab'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a91c5ba94272235045f917e1ca06ac695',1,'COLOR_LRGB2Lab(Global Namespace)']]], + ['color_5flrgb2luv_962',['COLOR_LRGB2Luv',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad3b1320c05a5bafe47ad1624f2bd9795',1,'cv::COLOR_LRGB2Luv'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad3b1320c05a5bafe47ad1624f2bd9795',1,'COLOR_LRGB2Luv(Global Namespace)']]], + ['color_5fluv2bgr_963',['COLOR_Luv2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a514896aa2d19659f6a2eca67bb0748f1',1,'cv::COLOR_Luv2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a514896aa2d19659f6a2eca67bb0748f1',1,'COLOR_Luv2BGR(Global Namespace)']]], + ['color_5fluv2lbgr_964',['COLOR_Luv2LBGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acb597d2d413d6d6e8e3d3fb9af456977',1,'cv::COLOR_Luv2LBGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0acb597d2d413d6d6e8e3d3fb9af456977',1,'COLOR_Luv2LBGR(Global Namespace)']]], + ['color_5fluv2lrgb_965',['COLOR_Luv2LRGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae92293540e102f1453c1e92a44274eaa',1,'cv::COLOR_Luv2LRGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae92293540e102f1453c1e92a44274eaa',1,'COLOR_Luv2LRGB(Global Namespace)']]], + ['color_5fluv2rgb_966',['COLOR_Luv2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8d68e3f1814d0a649731c0f56835b8c3',1,'cv::COLOR_Luv2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8d68e3f1814d0a649731c0f56835b8c3',1,'COLOR_Luv2RGB(Global Namespace)']]], + ['color_5fmatch_2ehpp_967',['color_match.hpp',['https://docs.opencv.org/4.2.0/da/dc9/color__match_8hpp.html',1,'']]], + ['color_5fmoment_5fhash_2ehpp_968',['color_moment_hash.hpp',['https://docs.opencv.org/4.2.0/d1/d01/color__moment__hash_8hpp.html',1,'']]], + ['color_5fmrgba2rgba_969',['COLOR_mRGBA2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3df7ec7a7d3b2e2334d708355b5ca0f7',1,'cv::COLOR_mRGBA2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3df7ec7a7d3b2e2334d708355b5ca0f7',1,'COLOR_mRGBA2RGBA(Global Namespace)']]], + ['color_5frgb2bgr_970',['COLOR_RGB2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a01a06e50cd3689f5e34e26daf3faaa39',1,'cv::COLOR_RGB2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a01a06e50cd3689f5e34e26daf3faaa39',1,'COLOR_RGB2BGR(Global Namespace)']]], + ['color_5frgb2bgr555_971',['COLOR_RGB2BGR555',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad69f042a9cd91477d6812297d43715dd',1,'cv::COLOR_RGB2BGR555'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad69f042a9cd91477d6812297d43715dd',1,'COLOR_RGB2BGR555(Global Namespace)']]], + ['color_5frgb2bgr565_972',['COLOR_RGB2BGR565',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7f23f766a333054b25188834fc369a76',1,'cv::COLOR_RGB2BGR565'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7f23f766a333054b25188834fc369a76',1,'COLOR_RGB2BGR565(Global Namespace)']]], + ['color_5frgb2bgra_973',['COLOR_RGB2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3b0277b8e071d0f082110e18dfe0fabc',1,'cv::COLOR_RGB2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3b0277b8e071d0f082110e18dfe0fabc',1,'COLOR_RGB2BGRA(Global Namespace)']]], + ['color_5frgb2gray_974',['COLOR_RGB2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae50d0c66ee53e974234ac84cf51d1d4e',1,'cv::COLOR_RGB2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae50d0c66ee53e974234ac84cf51d1d4e',1,'COLOR_RGB2GRAY(Global Namespace)']]], + ['color_5frgb2hls_975',['COLOR_RGB2HLS',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac3d926b985b034433c49fc84de84c85f',1,'cv::COLOR_RGB2HLS'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac3d926b985b034433c49fc84de84c85f',1,'COLOR_RGB2HLS(Global Namespace)']]], + ['color_5frgb2hls_5ffull_976',['COLOR_RGB2HLS_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af331447e78b1e36890985eaf013713b1',1,'cv::COLOR_RGB2HLS_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af331447e78b1e36890985eaf013713b1',1,'COLOR_RGB2HLS_FULL(Global Namespace)']]], + ['color_5frgb2hsv_977',['COLOR_RGB2HSV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa4f6bc658bc546e1660fcab6bf7858f4',1,'cv::COLOR_RGB2HSV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa4f6bc658bc546e1660fcab6bf7858f4',1,'COLOR_RGB2HSV(Global Namespace)']]], + ['color_5frgb2hsv_5ffull_978',['COLOR_RGB2HSV_FULL',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae0070d7e97f1e565cc0992d038e5498e',1,'cv::COLOR_RGB2HSV_FULL'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae0070d7e97f1e565cc0992d038e5498e',1,'COLOR_RGB2HSV_FULL(Global Namespace)']]], + ['color_5frgb2lab_979',['COLOR_RGB2Lab',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afc25858d4f1127d6051d881d5f4e2b6e',1,'cv::COLOR_RGB2Lab'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afc25858d4f1127d6051d881d5f4e2b6e',1,'COLOR_RGB2Lab(Global Namespace)']]], + ['color_5frgb2luv_980',['COLOR_RGB2Luv',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a5e11d9e294ba89668c080662a8321e45',1,'cv::COLOR_RGB2Luv'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a5e11d9e294ba89668c080662a8321e45',1,'COLOR_RGB2Luv(Global Namespace)']]], + ['color_5frgb2rgba_981',['COLOR_RGB2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0adf2b652f599a5d172d815f849ec35ed5',1,'cv::COLOR_RGB2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0adf2b652f599a5d172d815f849ec35ed5',1,'COLOR_RGB2RGBA(Global Namespace)']]], + ['color_5frgb2xyz_982',['COLOR_RGB2XYZ',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af3894ec8b239815e8a9075099805991a',1,'cv::COLOR_RGB2XYZ'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af3894ec8b239815e8a9075099805991a',1,'COLOR_RGB2XYZ(Global Namespace)']]], + ['color_5frgb2ycrcb_983',['COLOR_RGB2YCrCb',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a56022734d5961924a9e556879f6f05a2',1,'cv::COLOR_RGB2YCrCb'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a56022734d5961924a9e556879f6f05a2',1,'COLOR_RGB2YCrCb(Global Namespace)']]], + ['color_5frgb2yuv_984',['COLOR_RGB2YUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0adc0f8a1354c98d1701caad4b384e0d18',1,'cv::COLOR_RGB2YUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0adc0f8a1354c98d1701caad4b384e0d18',1,'COLOR_RGB2YUV(Global Namespace)']]], + ['color_5frgb2yuv_5fi420_985',['COLOR_RGB2YUV_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8f8a8a89f99c0b9f950a054f5d4eccf8',1,'cv::COLOR_RGB2YUV_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8f8a8a89f99c0b9f950a054f5d4eccf8',1,'COLOR_RGB2YUV_I420(Global Namespace)']]], + ['color_5frgb2yuv_5fiyuv_986',['COLOR_RGB2YUV_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aaddfeb60300f516f4da44f3ea074c84a',1,'cv::COLOR_RGB2YUV_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aaddfeb60300f516f4da44f3ea074c84a',1,'COLOR_RGB2YUV_IYUV(Global Namespace)']]], + ['color_5frgb2yuv_5fyv12_987',['COLOR_RGB2YUV_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0d75409920733f0da9ae46904e0c9c7c',1,'cv::COLOR_RGB2YUV_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0d75409920733f0da9ae46904e0c9c7c',1,'COLOR_RGB2YUV_YV12(Global Namespace)']]], + ['color_5frgba2bgr_988',['COLOR_RGBA2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a03c045af20d58132727be38361297625',1,'cv::COLOR_RGBA2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a03c045af20d58132727be38361297625',1,'COLOR_RGBA2BGR(Global Namespace)']]], + ['color_5frgba2bgr555_989',['COLOR_RGBA2BGR555',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a44141655e91217b5416e3e8be076f3d4',1,'cv::COLOR_RGBA2BGR555'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a44141655e91217b5416e3e8be076f3d4',1,'COLOR_RGBA2BGR555(Global Namespace)']]], + ['color_5frgba2bgr565_990',['COLOR_RGBA2BGR565',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2bdc4a573b742c8c2ba0554287eb8970',1,'cv::COLOR_RGBA2BGR565'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2bdc4a573b742c8c2ba0554287eb8970',1,'COLOR_RGBA2BGR565(Global Namespace)']]], + ['color_5frgba2bgra_991',['COLOR_RGBA2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a488919a903d6434cacc6a47cf058d803',1,'cv::COLOR_RGBA2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a488919a903d6434cacc6a47cf058d803',1,'COLOR_RGBA2BGRA(Global Namespace)']]], + ['color_5frgba2gray_992',['COLOR_RGBA2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a85254b7acc2eb0171639906911f612e8',1,'cv::COLOR_RGBA2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a85254b7acc2eb0171639906911f612e8',1,'COLOR_RGBA2GRAY(Global Namespace)']]], + ['color_5frgba2mrgba_993',['COLOR_RGBA2mRGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8ce54170c486e2deddac3aff035f4af7',1,'cv::COLOR_RGBA2mRGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8ce54170c486e2deddac3aff035f4af7',1,'COLOR_RGBA2mRGBA(Global Namespace)']]], + ['color_5frgba2rgb_994',['COLOR_RGBA2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a6a41529c15d9874918d2b312a7d3f138',1,'cv::COLOR_RGBA2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a6a41529c15d9874918d2b312a7d3f138',1,'COLOR_RGBA2RGB(Global Namespace)']]], + ['color_5frgba2yuv_5fi420_995',['COLOR_RGBA2YUV_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abe780d95b79398395c219742a7f3a6c0',1,'cv::COLOR_RGBA2YUV_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abe780d95b79398395c219742a7f3a6c0',1,'COLOR_RGBA2YUV_I420(Global Namespace)']]], + ['color_5frgba2yuv_5fiyuv_996',['COLOR_RGBA2YUV_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa3d872ebd8d2c7bc99b58ac56f7cb68a',1,'cv::COLOR_RGBA2YUV_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa3d872ebd8d2c7bc99b58ac56f7cb68a',1,'COLOR_RGBA2YUV_IYUV(Global Namespace)']]], + ['color_5frgba2yuv_5fyv12_997',['COLOR_RGBA2YUV_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a9d7c47d20a3bb71640ad35eb9275e094',1,'cv::COLOR_RGBA2YUV_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a9d7c47d20a3bb71640ad35eb9275e094',1,'COLOR_RGBA2YUV_YV12(Global Namespace)']]], + ['color_5fxyz2bgr_998',['COLOR_XYZ2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa4d7480cfca520a55ae13ff0c5268796',1,'cv::COLOR_XYZ2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa4d7480cfca520a55ae13ff0c5268796',1,'COLOR_XYZ2BGR(Global Namespace)']]], + ['color_5fxyz2rgb_999',['COLOR_XYZ2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a95815945a63cc47ce9237654857f231e',1,'cv::COLOR_XYZ2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a95815945a63cc47ce9237654857f231e',1,'COLOR_XYZ2RGB(Global Namespace)']]], + ['color_5fycrcb2bgr_1000',['COLOR_YCrCb2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa6d4108b0f3d5e21dc246a0c59592b38',1,'cv::COLOR_YCrCb2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa6d4108b0f3d5e21dc246a0c59592b38',1,'COLOR_YCrCb2BGR(Global Namespace)']]], + ['color_5fycrcb2rgb_1001',['COLOR_YCrCb2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a27b56972a73ad4f2660512ac1cca552d',1,'cv::COLOR_YCrCb2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a27b56972a73ad4f2660512ac1cca552d',1,'COLOR_YCrCb2RGB(Global Namespace)']]], + ['color_5fyuv2bgr_1002',['COLOR_YUV2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab053f0cf23ae1b0bfee1964fd9a182c9',1,'cv::COLOR_YUV2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab053f0cf23ae1b0bfee1964fd9a182c9',1,'COLOR_YUV2BGR(Global Namespace)']]], + ['color_5fyuv2bgr_5fi420_1003',['COLOR_YUV2BGR_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a305e5da3816c78b3d1ffa0498424e94f',1,'cv::COLOR_YUV2BGR_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a305e5da3816c78b3d1ffa0498424e94f',1,'COLOR_YUV2BGR_I420(Global Namespace)']]], + ['color_5fyuv2bgr_5fiyuv_1004',['COLOR_YUV2BGR_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af60dd40f7223d5409bc9abb84d6f2970',1,'cv::COLOR_YUV2BGR_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af60dd40f7223d5409bc9abb84d6f2970',1,'COLOR_YUV2BGR_IYUV(Global Namespace)']]], + ['color_5fyuv2bgr_5fnv12_1005',['COLOR_YUV2BGR_NV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3e07baa107cda0b6756eb112fb5c3f4e',1,'cv::COLOR_YUV2BGR_NV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3e07baa107cda0b6756eb112fb5c3f4e',1,'COLOR_YUV2BGR_NV12(Global Namespace)']]], + ['color_5fyuv2bgr_5fnv21_1006',['COLOR_YUV2BGR_NV21',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa8a2838076779f05746a7649319be286',1,'cv::COLOR_YUV2BGR_NV21'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa8a2838076779f05746a7649319be286',1,'COLOR_YUV2BGR_NV21(Global Namespace)']]], + ['color_5fyuv2bgr_5fuynv_1007',['COLOR_YUV2BGR_UYNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abaf5dcb244262bee65b837b37ac8e8a2',1,'cv::COLOR_YUV2BGR_UYNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abaf5dcb244262bee65b837b37ac8e8a2',1,'COLOR_YUV2BGR_UYNV(Global Namespace)']]], + ['color_5fyuv2bgr_5fuyvy_1008',['COLOR_YUV2BGR_UYVY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae8538a74bb0f8c3dd5b11a6f32e5911d',1,'cv::COLOR_YUV2BGR_UYVY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ae8538a74bb0f8c3dd5b11a6f32e5911d',1,'COLOR_YUV2BGR_UYVY(Global Namespace)']]], + ['color_5fyuv2bgr_5fy422_1009',['COLOR_YUV2BGR_Y422',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afe8ad387e079dba85956e79930d782af',1,'cv::COLOR_YUV2BGR_Y422'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afe8ad387e079dba85956e79930d782af',1,'COLOR_YUV2BGR_Y422(Global Namespace)']]], + ['color_5fyuv2bgr_5fyunv_1010',['COLOR_YUV2BGR_YUNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4f49f8807de295e1b8cbfdac9c914d71',1,'cv::COLOR_YUV2BGR_YUNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4f49f8807de295e1b8cbfdac9c914d71',1,'COLOR_YUV2BGR_YUNV(Global Namespace)']]], + ['color_5fyuv2bgr_5fyuy2_1011',['COLOR_YUV2BGR_YUY2',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a262578eae5d795e1e00b4d50be95156a',1,'cv::COLOR_YUV2BGR_YUY2'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a262578eae5d795e1e00b4d50be95156a',1,'COLOR_YUV2BGR_YUY2(Global Namespace)']]], + ['color_5fyuv2bgr_5fyuyv_1012',['COLOR_YUV2BGR_YUYV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2b1df3d7a0714c9bfefd80e2aad75c2c',1,'cv::COLOR_YUV2BGR_YUYV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a2b1df3d7a0714c9bfefd80e2aad75c2c',1,'COLOR_YUV2BGR_YUYV(Global Namespace)']]], + ['color_5fyuv2bgr_5fyv12_1013',['COLOR_YUV2BGR_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a92235c803c5adda43042be73d4987137',1,'cv::COLOR_YUV2BGR_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a92235c803c5adda43042be73d4987137',1,'COLOR_YUV2BGR_YV12(Global Namespace)']]], + ['color_5fyuv2bgr_5fyvyu_1014',['COLOR_YUV2BGR_YVYU',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a89cb4aa303651e036048e1b21dd1f3d6',1,'cv::COLOR_YUV2BGR_YVYU'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a89cb4aa303651e036048e1b21dd1f3d6',1,'COLOR_YUV2BGR_YVYU(Global Namespace)']]], + ['color_5fyuv2bgra_5fi420_1015',['COLOR_YUV2BGRA_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0ffa81c19231ddd2e9cee8616a3a4673',1,'cv::COLOR_YUV2BGRA_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0ffa81c19231ddd2e9cee8616a3a4673',1,'COLOR_YUV2BGRA_I420(Global Namespace)']]], + ['color_5fyuv2bgra_5fiyuv_1016',['COLOR_YUV2BGRA_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a6417b107bad4465639435dd4ca8c90bf',1,'cv::COLOR_YUV2BGRA_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a6417b107bad4465639435dd4ca8c90bf',1,'COLOR_YUV2BGRA_IYUV(Global Namespace)']]], + ['color_5fyuv2bgra_5fnv12_1017',['COLOR_YUV2BGRA_NV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af7b3bf5d87c6e0174b9cb7694dd37c7b',1,'cv::COLOR_YUV2BGRA_NV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af7b3bf5d87c6e0174b9cb7694dd37c7b',1,'COLOR_YUV2BGRA_NV12(Global Namespace)']]], + ['color_5fyuv2bgra_5fnv21_1018',['COLOR_YUV2BGRA_NV21',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac21e90d9ba13a67d2a08fedc3c756708',1,'cv::COLOR_YUV2BGRA_NV21'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac21e90d9ba13a67d2a08fedc3c756708',1,'COLOR_YUV2BGRA_NV21(Global Namespace)']]], + ['color_5fyuv2bgra_5fuynv_1019',['COLOR_YUV2BGRA_UYNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4fc66a57ff5b814a23de5b97d97d37e8',1,'cv::COLOR_YUV2BGRA_UYNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4fc66a57ff5b814a23de5b97d97d37e8',1,'COLOR_YUV2BGRA_UYNV(Global Namespace)']]], + ['color_5fyuv2bgra_5fuyvy_1020',['COLOR_YUV2BGRA_UYVY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a464e09aadb40edf8fa9385d7a59c2803',1,'cv::COLOR_YUV2BGRA_UYVY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a464e09aadb40edf8fa9385d7a59c2803',1,'COLOR_YUV2BGRA_UYVY(Global Namespace)']]], + ['color_5fyuv2bgra_5fy422_1021',['COLOR_YUV2BGRA_Y422',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a631d75dcef319bce60e5703c44ab6a1f',1,'cv::COLOR_YUV2BGRA_Y422'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a631d75dcef319bce60e5703c44ab6a1f',1,'COLOR_YUV2BGRA_Y422(Global Namespace)']]], + ['color_5fyuv2bgra_5fyunv_1022',['COLOR_YUV2BGRA_YUNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0a7cf70088adfe277113bdc2bcf51029',1,'cv::COLOR_YUV2BGRA_YUNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0a7cf70088adfe277113bdc2bcf51029',1,'COLOR_YUV2BGRA_YUNV(Global Namespace)']]], + ['color_5fyuv2bgra_5fyuy2_1023',['COLOR_YUV2BGRA_YUY2',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aefbb246de87843ee087b55aa078a8c2b',1,'cv::COLOR_YUV2BGRA_YUY2'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aefbb246de87843ee087b55aa078a8c2b',1,'COLOR_YUV2BGRA_YUY2(Global Namespace)']]], + ['color_5fyuv2bgra_5fyuyv_1024',['COLOR_YUV2BGRA_YUYV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0968d9a3aa7ab48d3ddd5c1b9f526e8c',1,'cv::COLOR_YUV2BGRA_YUYV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0968d9a3aa7ab48d3ddd5c1b9f526e8c',1,'COLOR_YUV2BGRA_YUYV(Global Namespace)']]], + ['color_5fyuv2bgra_5fyv12_1025',['COLOR_YUV2BGRA_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a74d7d6d93ff31f5ed80161727b8e608d',1,'cv::COLOR_YUV2BGRA_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a74d7d6d93ff31f5ed80161727b8e608d',1,'COLOR_YUV2BGRA_YV12(Global Namespace)']]], + ['color_5fyuv2bgra_5fyvyu_1026',['COLOR_YUV2BGRA_YVYU',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a88ae64bdb5e399911e53caa809ab4df6',1,'cv::COLOR_YUV2BGRA_YVYU'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a88ae64bdb5e399911e53caa809ab4df6',1,'COLOR_YUV2BGRA_YVYU(Global Namespace)']]], + ['color_5fyuv2gray_5f420_1027',['COLOR_YUV2GRAY_420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac04bb1de2f067221ccf4659c8a4be4ea',1,'cv::COLOR_YUV2GRAY_420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac04bb1de2f067221ccf4659c8a4be4ea',1,'COLOR_YUV2GRAY_420(Global Namespace)']]], + ['color_5fyuv2gray_5fi420_1028',['COLOR_YUV2GRAY_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3bf49e55a5d764487966f03b80a09290',1,'cv::COLOR_YUV2GRAY_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3bf49e55a5d764487966f03b80a09290',1,'COLOR_YUV2GRAY_I420(Global Namespace)']]], + ['color_5fyuv2gray_5fiyuv_1029',['COLOR_YUV2GRAY_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aba65ee89da14eaa6222ed0acdb1078cd',1,'cv::COLOR_YUV2GRAY_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aba65ee89da14eaa6222ed0acdb1078cd',1,'COLOR_YUV2GRAY_IYUV(Global Namespace)']]], + ['color_5fyuv2gray_5fnv12_1030',['COLOR_YUV2GRAY_NV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac5c033333be1929eaea9da93b7008e20',1,'cv::COLOR_YUV2GRAY_NV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ac5c033333be1929eaea9da93b7008e20',1,'COLOR_YUV2GRAY_NV12(Global Namespace)']]], + ['color_5fyuv2gray_5fnv21_1031',['COLOR_YUV2GRAY_NV21',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1cba7092b4f0302693526ca578159ea0',1,'cv::COLOR_YUV2GRAY_NV21'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1cba7092b4f0302693526ca578159ea0',1,'COLOR_YUV2GRAY_NV21(Global Namespace)']]], + ['color_5fyuv2gray_5fuynv_1032',['COLOR_YUV2GRAY_UYNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1015db548386c49010a90d41f90fd11d',1,'cv::COLOR_YUV2GRAY_UYNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1015db548386c49010a90d41f90fd11d',1,'COLOR_YUV2GRAY_UYNV(Global Namespace)']]], + ['color_5fyuv2gray_5fuyvy_1033',['COLOR_YUV2GRAY_UYVY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab4a49ff92449a5587639bdd6ab098d5a',1,'cv::COLOR_YUV2GRAY_UYVY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab4a49ff92449a5587639bdd6ab098d5a',1,'COLOR_YUV2GRAY_UYVY(Global Namespace)']]], + ['color_5fyuv2gray_5fy422_1034',['COLOR_YUV2GRAY_Y422',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1ff10701b9d77e85ba2454172b4e5712',1,'cv::COLOR_YUV2GRAY_Y422'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a1ff10701b9d77e85ba2454172b4e5712',1,'COLOR_YUV2GRAY_Y422(Global Namespace)']]], + ['color_5fyuv2gray_5fyunv_1035',['COLOR_YUV2GRAY_YUNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abb11c6daa922c7c9fa6b6c8d474c78a6',1,'cv::COLOR_YUV2GRAY_YUNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0abb11c6daa922c7c9fa6b6c8d474c78a6',1,'COLOR_YUV2GRAY_YUNV(Global Namespace)']]], + ['color_5fyuv2gray_5fyuy2_1036',['COLOR_YUV2GRAY_YUY2',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3df6e6d6a38058a5b477c48b7fa519c8',1,'cv::COLOR_YUV2GRAY_YUY2'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3df6e6d6a38058a5b477c48b7fa519c8',1,'COLOR_YUV2GRAY_YUY2(Global Namespace)']]], + ['color_5fyuv2gray_5fyuyv_1037',['COLOR_YUV2GRAY_YUYV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0655ee55d0a0379b100832d01cc3069e',1,'cv::COLOR_YUV2GRAY_YUYV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0655ee55d0a0379b100832d01cc3069e',1,'COLOR_YUV2GRAY_YUYV(Global Namespace)']]], + ['color_5fyuv2gray_5fyv12_1038',['COLOR_YUV2GRAY_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a706e646e6be8567bfda6d0a2ea15a1b1',1,'cv::COLOR_YUV2GRAY_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a706e646e6be8567bfda6d0a2ea15a1b1',1,'COLOR_YUV2GRAY_YV12(Global Namespace)']]], + ['color_5fyuv2gray_5fyvyu_1039',['COLOR_YUV2GRAY_YVYU',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a89fd5683a25e142cb2c29acab04dc4c9',1,'cv::COLOR_YUV2GRAY_YVYU'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a89fd5683a25e142cb2c29acab04dc4c9',1,'COLOR_YUV2GRAY_YVYU(Global Namespace)']]], + ['color_5fyuv2rgb_1040',['COLOR_YUV2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab09d8186a9e5aaac83acd157a1be43b0',1,'cv::COLOR_YUV2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab09d8186a9e5aaac83acd157a1be43b0',1,'COLOR_YUV2RGB(Global Namespace)']]], + ['color_5fyuv2rgb_5fi420_1041',['COLOR_YUV2RGB_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a35687717fabb536c1e1ec0857714aaf9',1,'cv::COLOR_YUV2RGB_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a35687717fabb536c1e1ec0857714aaf9',1,'COLOR_YUV2RGB_I420(Global Namespace)']]], + ['color_5fyuv2rgb_5fiyuv_1042',['COLOR_YUV2RGB_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8673261b10ad0a1a7b1ff19dbd7bc818',1,'cv::COLOR_YUV2RGB_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8673261b10ad0a1a7b1ff19dbd7bc818',1,'COLOR_YUV2RGB_IYUV(Global Namespace)']]], + ['color_5fyuv2rgb_5fnv12_1043',['COLOR_YUV2RGB_NV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a86027a131a58ef888873fafd4eb603d0',1,'cv::COLOR_YUV2RGB_NV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a86027a131a58ef888873fafd4eb603d0',1,'COLOR_YUV2RGB_NV12(Global Namespace)']]], + ['color_5fyuv2rgb_5fnv21_1044',['COLOR_YUV2RGB_NV21',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a32167a86e9b39dbcba4c67a9413cf1a7',1,'cv::COLOR_YUV2RGB_NV21'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a32167a86e9b39dbcba4c67a9413cf1a7',1,'COLOR_YUV2RGB_NV21(Global Namespace)']]], + ['color_5fyuv2rgb_5fuynv_1045',['COLOR_YUV2RGB_UYNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a30c182e297e92cccca92300d3c3df3e4',1,'cv::COLOR_YUV2RGB_UYNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a30c182e297e92cccca92300d3c3df3e4',1,'COLOR_YUV2RGB_UYNV(Global Namespace)']]], + ['color_5fyuv2rgb_5fuyvy_1046',['COLOR_YUV2RGB_UYVY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a59161264b3a52d23b677fd495cc56abc',1,'cv::COLOR_YUV2RGB_UYVY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a59161264b3a52d23b677fd495cc56abc',1,'COLOR_YUV2RGB_UYVY(Global Namespace)']]], + ['color_5fyuv2rgb_5fy422_1047',['COLOR_YUV2RGB_Y422',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0adec44ab1f36e17aad9907c99f277562b',1,'cv::COLOR_YUV2RGB_Y422'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0adec44ab1f36e17aad9907c99f277562b',1,'COLOR_YUV2RGB_Y422(Global Namespace)']]], + ['color_5fyuv2rgb_5fyunv_1048',['COLOR_YUV2RGB_YUNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a02c191ee6abdf1c06cc95225f1169dbd',1,'cv::COLOR_YUV2RGB_YUNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a02c191ee6abdf1c06cc95225f1169dbd',1,'COLOR_YUV2RGB_YUNV(Global Namespace)']]], + ['color_5fyuv2rgb_5fyuy2_1049',['COLOR_YUV2RGB_YUY2',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7543b3884ee368db305c8e43da00ca3e',1,'cv::COLOR_YUV2RGB_YUY2'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7543b3884ee368db305c8e43da00ca3e',1,'COLOR_YUV2RGB_YUY2(Global Namespace)']]], + ['color_5fyuv2rgb_5fyuyv_1050',['COLOR_YUV2RGB_YUYV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a816129bdd294a57642d1428f26ba611b',1,'cv::COLOR_YUV2RGB_YUYV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a816129bdd294a57642d1428f26ba611b',1,'COLOR_YUV2RGB_YUYV(Global Namespace)']]], + ['color_5fyuv2rgb_5fyv12_1051',['COLOR_YUV2RGB_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a55cc4531c9aac17e0a8e7dbf222fffe2',1,'cv::COLOR_YUV2RGB_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a55cc4531c9aac17e0a8e7dbf222fffe2',1,'COLOR_YUV2RGB_YV12(Global Namespace)']]], + ['color_5fyuv2rgb_5fyvyu_1052',['COLOR_YUV2RGB_YVYU',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa03abded4be87e3c67170203f4fb1fb0',1,'cv::COLOR_YUV2RGB_YVYU'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aa03abded4be87e3c67170203f4fb1fb0',1,'COLOR_YUV2RGB_YVYU(Global Namespace)']]], + ['color_5fyuv2rgba_5fi420_1053',['COLOR_YUV2RGBA_I420',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a18346327c937bca2aa2856914ff11507',1,'cv::COLOR_YUV2RGBA_I420'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a18346327c937bca2aa2856914ff11507',1,'COLOR_YUV2RGBA_I420(Global Namespace)']]], + ['color_5fyuv2rgba_5fiyuv_1054',['COLOR_YUV2RGBA_IYUV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a616b629a231a86ff57deca4ab2451972',1,'cv::COLOR_YUV2RGBA_IYUV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a616b629a231a86ff57deca4ab2451972',1,'COLOR_YUV2RGBA_IYUV(Global Namespace)']]], + ['color_5fyuv2rgba_5fnv12_1055',['COLOR_YUV2RGBA_NV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aaa0df213a6548ebef3469f78d4e5d842',1,'cv::COLOR_YUV2RGBA_NV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aaa0df213a6548ebef3469f78d4e5d842',1,'COLOR_YUV2RGBA_NV12(Global Namespace)']]], + ['color_5fyuv2rgba_5fnv21_1056',['COLOR_YUV2RGBA_NV21',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3816bd6f95595fe01c7c488a0b411939',1,'cv::COLOR_YUV2RGBA_NV21'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a3816bd6f95595fe01c7c488a0b411939',1,'COLOR_YUV2RGBA_NV21(Global Namespace)']]], + ['color_5fyuv2rgba_5fuynv_1057',['COLOR_YUV2RGBA_UYNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a78ee01c55618829bcf63e80add4ba702',1,'cv::COLOR_YUV2RGBA_UYNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a78ee01c55618829bcf63e80add4ba702',1,'COLOR_YUV2RGBA_UYNV(Global Namespace)']]], + ['color_5fyuv2rgba_5fuyvy_1058',['COLOR_YUV2RGBA_UYVY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a82fe41ee206c9d3ee78bce75d1fcf2de',1,'cv::COLOR_YUV2RGBA_UYVY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a82fe41ee206c9d3ee78bce75d1fcf2de',1,'COLOR_YUV2RGBA_UYVY(Global Namespace)']]], + ['color_5fyuv2rgba_5fy422_1059',['COLOR_YUV2RGBA_Y422',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a736392e7b201d7cfce88e051fc5addb1',1,'cv::COLOR_YUV2RGBA_Y422'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a736392e7b201d7cfce88e051fc5addb1',1,'COLOR_YUV2RGBA_Y422(Global Namespace)']]], + ['color_5fyuv2rgba_5fyunv_1060',['COLOR_YUV2RGBA_YUNV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8f49b5b3a04d065814bd1dade3494d99',1,'cv::COLOR_YUV2RGBA_YUNV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a8f49b5b3a04d065814bd1dade3494d99',1,'COLOR_YUV2RGBA_YUNV(Global Namespace)']]], + ['color_5fyuv2rgba_5fyuy2_1061',['COLOR_YUV2RGBA_YUY2',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af31f4e5b4f6dc223d87115918779f0ad',1,'cv::COLOR_YUV2RGBA_YUY2'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0af31f4e5b4f6dc223d87115918779f0ad',1,'COLOR_YUV2RGBA_YUY2(Global Namespace)']]], + ['color_5fyuv2rgba_5fyuyv_1062',['COLOR_YUV2RGBA_YUYV',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a20dc8999c02e700ea548bf6b5926e2b5',1,'cv::COLOR_YUV2RGBA_YUYV'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a20dc8999c02e700ea548bf6b5926e2b5',1,'COLOR_YUV2RGBA_YUYV(Global Namespace)']]], + ['color_5fyuv2rgba_5fyv12_1063',['COLOR_YUV2RGBA_YV12',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab454d840f4d6f682538d3eac06ace494',1,'cv::COLOR_YUV2RGBA_YV12'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ab454d840f4d6f682538d3eac06ace494',1,'COLOR_YUV2RGBA_YV12(Global Namespace)']]], + ['color_5fyuv2rgba_5fyvyu_1064',['COLOR_YUV2RGBA_YVYU',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a09d8ecbc19025a376a5173f8d5b888a3',1,'cv::COLOR_YUV2RGBA_YVYU'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a09d8ecbc19025a376a5173f8d5b888a3',1,'COLOR_YUV2RGBA_YVYU(Global Namespace)']]], + ['color_5fyuv420p2bgr_1065',['COLOR_YUV420p2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0609f45b27b113b6faf342e95fbc7bfb',1,'cv::COLOR_YUV420p2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0609f45b27b113b6faf342e95fbc7bfb',1,'COLOR_YUV420p2BGR(Global Namespace)']]], + ['color_5fyuv420p2bgra_1066',['COLOR_YUV420p2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a201fb31ede4712386f6b1c04299f0e3d',1,'cv::COLOR_YUV420p2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a201fb31ede4712386f6b1c04299f0e3d',1,'COLOR_YUV420p2BGRA(Global Namespace)']]], + ['color_5fyuv420p2gray_1067',['COLOR_YUV420p2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a6d90778212c0069b195ed94bf7db23ee',1,'cv::COLOR_YUV420p2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a6d90778212c0069b195ed94bf7db23ee',1,'COLOR_YUV420p2GRAY(Global Namespace)']]], + ['color_5fyuv420p2rgb_1068',['COLOR_YUV420p2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afbccef9d394822d30408994976e594c9',1,'cv::COLOR_YUV420p2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0afbccef9d394822d30408994976e594c9',1,'COLOR_YUV420p2RGB(Global Namespace)']]], + ['color_5fyuv420p2rgba_1069',['COLOR_YUV420p2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aface8da7f925912e04a3cec8377754e4',1,'cv::COLOR_YUV420p2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0aface8da7f925912e04a3cec8377754e4',1,'COLOR_YUV420p2RGBA(Global Namespace)']]], + ['color_5fyuv420sp2bgr_1070',['COLOR_YUV420sp2BGR',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ada5e32ef7600f3786731d4d0e3128194',1,'cv::COLOR_YUV420sp2BGR'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ada5e32ef7600f3786731d4d0e3128194',1,'COLOR_YUV420sp2BGR(Global Namespace)']]], + ['color_5fyuv420sp2bgra_1071',['COLOR_YUV420sp2BGRA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4356f38558b9ec0c2522142833116507',1,'cv::COLOR_YUV420sp2BGRA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a4356f38558b9ec0c2522142833116507',1,'COLOR_YUV420sp2BGRA(Global Namespace)']]], + ['color_5fyuv420sp2gray_1072',['COLOR_YUV420sp2GRAY',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad67afc6fc415586e101b2881f73a2eff',1,'cv::COLOR_YUV420sp2GRAY'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0ad67afc6fc415586e101b2881f73a2eff',1,'COLOR_YUV420sp2GRAY(Global Namespace)']]], + ['color_5fyuv420sp2rgb_1073',['COLOR_YUV420sp2RGB',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0c598794f13df7b2e48cfc77a65bf0f6',1,'cv::COLOR_YUV420sp2RGB'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a0c598794f13df7b2e48cfc77a65bf0f6',1,'COLOR_YUV420sp2RGB(Global Namespace)']]], + ['color_5fyuv420sp2rgba_1074',['COLOR_YUV420sp2RGBA',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7490daf39c58de9be425f33714d92e7b',1,'cv::COLOR_YUV420sp2RGBA'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#gga4e0972be5de079fed4e3a10e24ef5ef0a7490daf39c58de9be425f33714d92e7b',1,'COLOR_YUV420sp2RGBA(Global Namespace)']]], + ['coloraverageinpainter_1075',['ColorAverageInpainter',['https://docs.opencv.org/4.2.0/d1/dc6/classcv_1_1videostab_1_1ColorAverageInpainter.html',1,'cv::videostab']]], + ['colorchange_1076',['colorChange',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#ga6684f35dc669ff6196a7c340dc73b98e',1,'cv::colorChange()'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#ga6684f35dc669ff6196a7c340dc73b98e',1,'colorChange()(Global Namespace)']]], + ['colorconversioncodes_1077',['ColorConversionCodes',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga4e0972be5de079fed4e3a10e24ef5ef0',1,'cv::ColorConversionCodes'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga4e0972be5de079fed4e3a10e24ef5ef0',1,'ColorConversionCodes(Global Namespace)']]], + ['colorgradient_1078',['ColorGradient',['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html',1,'cv::linemod::ColorGradient'],['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a95a30b50bb3ee9788171a9aca7e49e01',1,'cv::linemod::ColorGradient::ColorGradient()'],['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#ab7fa732bb8f0c1079ae60d28eea8c8d9',1,'cv::linemod::ColorGradient::ColorGradient(float weak_threshold, size_t num_features, float strong_threshold)']]], + ['colorinpainter_1079',['ColorInpainter',['https://docs.opencv.org/4.2.0/d3/d2b/classcv_1_1videostab_1_1ColorInpainter.html',1,'cv::videostab::ColorInpainter'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga23ab7e15cf5caaf624a90607d863c07e',1,'cv::videostab::ColorInpainter::ColorInpainter()'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#ga23ab7e15cf5caaf624a90607d863c07e',1,'ColorInpainter()(Global Namespace)']]], + ['colormap_1080',['colormap',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaa6148fb2b9582f983782fdc89afe3384',1,'cv::linemod::colormap()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaa6148fb2b9582f983782fdc89afe3384',1,'colormap()(Global Namespace)']]], + ['colormap_5fautumn_1081',['COLORMAP_AUTUMN',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a5d4a709cda1130bfa3cc4b4c5ae8f82a',1,'cv::COLORMAP_AUTUMN'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a5d4a709cda1130bfa3cc4b4c5ae8f82a',1,'COLORMAP_AUTUMN(Global Namespace)']]], + ['colormap_5fbone_1082',['COLORMAP_BONE',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a91d58e66f015ea030150bdc8545d3b41',1,'cv::COLORMAP_BONE'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a91d58e66f015ea030150bdc8545d3b41',1,'COLORMAP_BONE(Global Namespace)']]], + ['colormap_5fcividis_1083',['COLORMAP_CIVIDIS',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a9742bb11678692f9ba22c7c0c0fa1abd',1,'cv::COLORMAP_CIVIDIS'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a9742bb11678692f9ba22c7c0c0fa1abd',1,'COLORMAP_CIVIDIS(Global Namespace)']]], + ['colormap_5fcool_1084',['COLORMAP_COOL',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a16c23a6bf984dc0f7a9704bd16fd6917',1,'cv::COLORMAP_COOL'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a16c23a6bf984dc0f7a9704bd16fd6917',1,'COLORMAP_COOL(Global Namespace)']]], + ['colormap_5fhot_1085',['COLORMAP_HOT',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65aef83628a5b46e23bf823000ff0270304',1,'cv::COLORMAP_HOT'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65aef83628a5b46e23bf823000ff0270304',1,'COLORMAP_HOT(Global Namespace)']]], + ['colormap_5fhsv_1086',['COLORMAP_HSV',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a141ad9bfece7aa670ff3bddd38fac98e',1,'cv::COLORMAP_HSV'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a141ad9bfece7aa670ff3bddd38fac98e',1,'COLORMAP_HSV(Global Namespace)']]], + ['colormap_5finferno_1087',['COLORMAP_INFERNO',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ab5e0464f3ac7083a8f030a45f24005fa',1,'cv::COLORMAP_INFERNO'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ab5e0464f3ac7083a8f030a45f24005fa',1,'COLORMAP_INFERNO(Global Namespace)']]], + ['colormap_5fjet_1088',['COLORMAP_JET',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ab3f207661ddf74511b002b1acda5ec09',1,'cv::COLORMAP_JET'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ab3f207661ddf74511b002b1acda5ec09',1,'COLORMAP_JET(Global Namespace)']]], + ['colormap_5fmagma_1089',['COLORMAP_MAGMA',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ad4b00db72c380f9227c3f48b32121eb7',1,'cv::COLORMAP_MAGMA'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ad4b00db72c380f9227c3f48b32121eb7',1,'COLORMAP_MAGMA(Global Namespace)']]], + ['colormap_5focean_1090',['COLORMAP_OCEAN',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a8c4210cb135b2555ba95e2db97f65ace',1,'cv::COLORMAP_OCEAN'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a8c4210cb135b2555ba95e2db97f65ace',1,'COLORMAP_OCEAN(Global Namespace)']]], + ['colormap_5fparula_1091',['COLORMAP_PARULA',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a48cbda63f52a232eea096a54f2a7572d',1,'cv::COLORMAP_PARULA'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a48cbda63f52a232eea096a54f2a7572d',1,'COLORMAP_PARULA(Global Namespace)']]], + ['colormap_5fpink_1092',['COLORMAP_PINK',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a84213aa42eaa8fcadacde9fc33a4d88b',1,'cv::COLORMAP_PINK'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a84213aa42eaa8fcadacde9fc33a4d88b',1,'COLORMAP_PINK(Global Namespace)']]], + ['colormap_5fplasma_1093',['COLORMAP_PLASMA',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a732a833f9939122143cfb7772cabd10d',1,'cv::COLORMAP_PLASMA'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a732a833f9939122143cfb7772cabd10d',1,'COLORMAP_PLASMA(Global Namespace)']]], + ['colormap_5frainbow_1094',['COLORMAP_RAINBOW',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65af7f0add024009b0e43f8c83f3ca0b923',1,'cv::COLORMAP_RAINBOW'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65af7f0add024009b0e43f8c83f3ca0b923',1,'COLORMAP_RAINBOW(Global Namespace)']]], + ['colormap_5fspring_1095',['COLORMAP_SPRING',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65afde88b0caed8acc01447906d700b99fb',1,'cv::COLORMAP_SPRING'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65afde88b0caed8acc01447906d700b99fb',1,'COLORMAP_SPRING(Global Namespace)']]], + ['colormap_5fsummer_1096',['COLORMAP_SUMMER',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a5e032add919a3c2c447182f0815d2a6f',1,'cv::COLORMAP_SUMMER'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a5e032add919a3c2c447182f0815d2a6f',1,'COLORMAP_SUMMER(Global Namespace)']]], + ['colormap_5fturbo_1097',['COLORMAP_TURBO',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a61e4747e35b5775ea2ca27ac1484ad94',1,'cv::COLORMAP_TURBO'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a61e4747e35b5775ea2ca27ac1484ad94',1,'COLORMAP_TURBO(Global Namespace)']]], + ['colormap_5ftwilight_1098',['COLORMAP_TWILIGHT',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a2785d360bb7875d9a7127b3a7304f688',1,'cv::COLORMAP_TWILIGHT'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a2785d360bb7875d9a7127b3a7304f688',1,'COLORMAP_TWILIGHT(Global Namespace)']]], + ['colormap_5ftwilight_5fshifted_1099',['COLORMAP_TWILIGHT_SHIFTED',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ae0deafa5ab38bd25d34b620c1778e52c',1,'cv::COLORMAP_TWILIGHT_SHIFTED'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65ae0deafa5ab38bd25d34b620c1778e52c',1,'COLORMAP_TWILIGHT_SHIFTED(Global Namespace)']]], + ['colormap_5fviridis_1100',['COLORMAP_VIRIDIS',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65afdb81862da35ea4912a75f0e8f274aeb',1,'cv::COLORMAP_VIRIDIS'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65afdb81862da35ea4912a75f0e8f274aeb',1,'COLORMAP_VIRIDIS(Global Namespace)']]], + ['colormap_5fwinter_1101',['COLORMAP_WINTER',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a66b53e69b9d61792e57008962dbef670',1,'cv::COLORMAP_WINTER'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#gga9a805d8262bcbe273f16be9ea2055a65a66b53e69b9d61792e57008962dbef670',1,'COLORMAP_WINTER(Global Namespace)']]], + ['colormaps_20in_20opencv_1102',['ColorMaps in OpenCV',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html',1,'']]], + ['colormaptypes_1103',['ColormapTypes',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#ga9a805d8262bcbe273f16be9ea2055a65',1,'cv::ColormapTypes'],['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html#ga9a805d8262bcbe273f16be9ea2055a65',1,'ColormapTypes(Global Namespace)']]], + ['colormatchtemplate_1104',['colorMatchTemplate',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga370f180e4a52231ba218adbb4a65a9ca',1,'cv::ximgproc::colorMatchTemplate()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga370f180e4a52231ba218adbb4a65a9ca',1,'colorMatchTemplate()(Global Namespace)']]], + ['colormode_1105',['colorMode',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#ae9360e586da9c97389a18d4896efd7ae',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], + ['colormomenthash_1106',['ColorMomentHash',['https://docs.opencv.org/4.2.0/df/d52/classcv_1_1img__hash_1_1ColorMomentHash.html',1,'cv::img_hash::ColorMomentHash'],['https://docs.opencv.org/4.2.0/df/d52/classcv_1_1img__hash_1_1ColorMomentHash.html#a5f541f69c95426c6f220fef2f88d47c5',1,'cv::img_hash::ColorMomentHash::ColorMomentHash()']]], + ['colormomenthash_1107',['colorMomentHash',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gac2b55a4cec31a709cee9f9cdd6b933f7',1,'cv::img_hash::colorMomentHash()'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gac2b55a4cec31a709cee9f9cdd6b933f7',1,'colorMomentHash()(Global Namespace)']]], + ['colors_1108',['colors',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a836d38fde4eb6f42ebfa9b1772d96ffe',1,'cv::viz::Mesh::colors'],['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html#a283a848fc7f6f246b5544bfc7e59c151',1,'cv::MultiTracker_Alt::colors']]], + ['colors_2emarkdown_1109',['colors.markdown',['https://docs.opencv.org/4.2.0/db/d92/colors_8markdown.html',1,'']]], + ['colorspace_5fbgr_1110',['COLORSPACE_BGR',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a8beca7fd4c27aed0d4ccfbfea567b094adde600835a7bb93f9ccc4ddeb806f487',1,'cv']]], + ['colorspace_5fgray_1111',['COLORSPACE_GRAY',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a8beca7fd4c27aed0d4ccfbfea567b094a45a2bba39a5ffe951554d85c20cac692',1,'cv']]], + ['colorspace_5frgba_1112',['COLORSPACE_RGBA',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a8beca7fd4c27aed0d4ccfbfea567b094a27d75a6c7cc43dae236d1805ed3db535',1,'cv']]], + ['colorspace_5fyuv444p_1113',['COLORSPACE_YUV444P',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a8beca7fd4c27aed0d4ccfbfea567b094a8be25c5947fe013a57d08c2b56423a2b',1,'cv']]], + ['colorspaces_1114',['Colorspaces',['https://docs.opencv.org/4.2.0/df/d9d/tutorial_py_colorspaces.html',1,'Changing Colorspaces'],['https://docs.opencv.org/4.2.0/db/d64/tutorial_js_colorspaces.html',1,'Changing Colorspaces']]], + ['colpivhouseholderqr_1115',['ColPivHouseholderQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html',1,'Eigen::ColPivHouseholderQR< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a9d8a92c2a2f0debe5454812372237ed4',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a1aa6a5b95380df0ceb224cb833316d4f',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a65782010a93a4c9ef4a9191ac8fe30bc',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a5965d4fdebc04b2df71d67ff0b2d0c2c',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a9d8a92c2a2f0debe5454812372237ed4',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a1aa6a5b95380df0ceb224cb833316d4f',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a65782010a93a4c9ef4a9191ac8fe30bc',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a5965d4fdebc04b2df71d67ff0b2d0c2c',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR(Index rows, Index cols)']]], + ['colpivhouseholderqr_1116',['colPivHouseholderQr',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adee8c19c833245bbb00a591dce68e8a4',1,'Eigen::MatrixBase::colPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adee8c19c833245bbb00a591dce68e8a4',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::colPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adee8c19c833245bbb00a591dce68e8a4',1,'MatrixBase< Solve< Decomposition, RhsType > >::colPivHouseholderQr()']]], + ['colpivhouseholderqr_3c_20matrixtype_20_3e_1117',['ColPivHouseholderQR< MatrixType >',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html',1,'']]], + ['colpivhouseholderqrpreconditioner_1118',['ColPivHouseholderQRPreconditioner',['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56eabd2e2f4875c5b4b6e602a433d90c4e5e',1,'Eigen::ColPivHouseholderQRPreconditioner'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56eabd2e2f4875c5b4b6e602a433d90c4e5e',1,'ColPivHouseholderQRPreconditioner(Global Namespace)']]], + ['colrange_1119',['colRange',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a7256892911593daf1bdefb183d6fd29e',1,'cv::cuda::GpuMat::colRange(int startcol, int endcol) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#acfcbd3a61ca20ec908dc6de76ef6e5bb',1,'cv::cuda::GpuMat::colRange(Range r) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#adb4d4ba56dc63484445f278b25819b90',1,'cv::cudev::GpuMat_::colRange(int startcol, int endcol) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ae3b1cd86db92d50c5776742796ecc8d1',1,'cv::cudev::GpuMat_::colRange(Range r) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aadc8f9210fe4dec50513746c246fa8d9',1,'cv::Mat::colRange(int startcol, int endcol) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#acccb63e44eba6ba81ead99881bd1997e',1,'cv::Mat::colRange(const Range &r) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#adc6ffa253b779dd078638ad996e17c2f',1,'cv::UMat::colRange(int startcol, int endcol) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ade9f05c6bae4f6de8b24cc71d29f4b8a',1,'cv::UMat::colRange(const Range &r) const']]], + ['cols_1120',['cols',['https://docs.opencv.org/4.2.0/dc/dd4/structcv_1_1cudev_1_1AffineMapPtrSz.html#ab04103a5cadd697f16551ec1d06a5538',1,'cv::cudev::AffineMapPtrSz::cols'],['https://docs.opencv.org/4.2.0/d1/d0a/structcv_1_1cudev_1_1BinaryTransformPtrSz.html#a45bd65681effecae503f07ac7388dcf9',1,'cv::cudev::BinaryTransformPtrSz::cols'],['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#ab7fc946112369fa8dfe9da2f3bcc907c',1,'cv::cudev::BrdBase::cols'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#ab4a86b939e2e5ce4e9cde73f3c49de1b',1,'cv::cudev::BrdConstant::cols'],['https://docs.opencv.org/4.2.0/db/d1c/structcv_1_1cudev_1_1CommonAreaInterPtrSz.html#a3fe3f0ac6fde783c6782e7439147facd',1,'cv::cudev::CommonAreaInterPtrSz::cols'],['https://docs.opencv.org/4.2.0/d2/df7/structcv_1_1cudev_1_1ConstantPtrSz.html#a53f800055b4a3659730a9dcfaa2825b5',1,'cv::cudev::ConstantPtrSz::cols'],['https://docs.opencv.org/4.2.0/d2/d00/structcv_1_1cudev_1_1CubicInterPtrSz.html#a302d953d0d2647a34327f752da10fbe1',1,'cv::cudev::CubicInterPtrSz::cols'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1cudev_1_1DerivXPtrSz.html#a093bb5e030fc3adbb677f07cc9955593',1,'cv::cudev::DerivXPtrSz::cols'],['https://docs.opencv.org/4.2.0/d2/dfc/structcv_1_1cudev_1_1DerivYPtrSz.html#a51cb03036af851d30b5e02cf1f52a11e',1,'cv::cudev::DerivYPtrSz::cols'],['https://docs.opencv.org/4.2.0/de/d2e/structcv_1_1cudev_1_1GlobPtrSz.html#adb3ca4dbb9b8925ab9b421d769aba582',1,'cv::cudev::GlobPtrSz::cols'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a9265a32d8d29fe29804a0cb8f57213e9',1,'cv::cuda::GpuMat::cols'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a637b04a3a6e107d9bdb16eba7ca238eb',1,'cv::cuda::HostMem::cols'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1cudev_1_1IntegerAreaInterPtrSz.html#ad4910674af0d4fd16d88db715bc5ccb8',1,'cv::cudev::IntegerAreaInterPtrSz::cols'],['https://docs.opencv.org/4.2.0/da/dd9/structcv_1_1cudev_1_1LaplacianPtrSz.html#ad1a2c27552dfe905142ce3052816fb9d',1,'cv::cudev::LaplacianPtrSz::cols'],['https://docs.opencv.org/4.2.0/d9/d2e/structcv_1_1cudev_1_1LinearInterPtrSz.html#a9a0fae7a594a696ae9b6c0aa73e2943d',1,'cv::cudev::LinearInterPtrSz::cols'],['https://docs.opencv.org/4.2.0/d5/d22/structcv_1_1cudev_1_1LutPtrSz.html#ab14ec3cd4a74a39f07867b3e44562cec',1,'cv::cudev::LutPtrSz::cols'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa3e5a47585c9ef6a0842556739155e3e',1,'cv::Mat::cols'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a7b4aa3ea06463a63874cfd82d59e4a75',1,'cv::gapi::own::detail::MatHeader::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'cv::Matx::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< _Tp, cn, 1 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, 1, 3 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, 2, 2 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, 2, 3 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, 3, 3 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, 3, 4 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, 4, 4 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< double, cn, 1 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< float, 2, 3 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< float, 3, 3 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< float, cn, 1 >::cols'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda0be112b36f43fbfe06e8f9d1361f51b6',1,'Matx< float_type, 4, 4 >::cols'],['https://docs.opencv.org/4.2.0/df/dd0/structcv_1_1cudev_1_1NearestInterPtrSz.html#a50108e007807808b344af0ae132938b2',1,'cv::cudev::NearestInterPtrSz::cols'],['https://docs.opencv.org/4.2.0/de/d6d/structcv_1_1cudev_1_1PerspectiveMapPtrSz.html#aede7b7b2981e566658ec6ab21131c47f',1,'cv::cudev::PerspectiveMapPtrSz::cols'],['https://docs.opencv.org/4.2.0/dd/d03/structcv_1_1cudev_1_1RemapPtr1Sz.html#aca43acf1aee056f634e8189998dbd24e',1,'cv::cudev::RemapPtr1Sz::cols'],['https://docs.opencv.org/4.2.0/d4/d59/structcv_1_1cudev_1_1RemapPtr2Sz.html#a9160c7e2fa0b96bb89809ef99ee618f8',1,'cv::cudev::RemapPtr2Sz::cols'],['https://docs.opencv.org/4.2.0/d3/d8a/structcv_1_1cudev_1_1ResizePtrSz.html#ae4826d69a30bdd765d42c8e89f035f11',1,'cv::cudev::ResizePtrSz::cols'],['https://docs.opencv.org/4.2.0/d2/d88/structcv_1_1cudev_1_1ScharrXPtrSz.html#ab58b3393067a6ca22c986d378f5682e3',1,'cv::cudev::ScharrXPtrSz::cols'],['https://docs.opencv.org/4.2.0/dd/def/structcv_1_1cudev_1_1ScharrYPtrSz.html#a42596ceb7190bc2d7fd08f62ad1cdd62',1,'cv::cudev::ScharrYPtrSz::cols'],['https://docs.opencv.org/4.2.0/d0/d19/structcv_1_1cudev_1_1SingleMaskChannelsSz.html#aa09300172aab353ae6f832a82332ba9b',1,'cv::cudev::SingleMaskChannelsSz::cols'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1cudev_1_1SobelXPtrSz.html#a3ef86e44c716aa79f52588b4c73cdd78',1,'cv::cudev::SobelXPtrSz::cols'],['https://docs.opencv.org/4.2.0/dd/dc6/structcv_1_1cudev_1_1SobelYPtrSz.html#ae513366ea296315544d37ab5b450b99b',1,'cv::cudev::SobelYPtrSz::cols'],['https://docs.opencv.org/4.2.0/d0/dc5/structcv_1_1cudev_1_1Texture.html#a17bbfc97ea7c60941c0161f2e9434a8f',1,'cv::cudev::Texture::cols'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a18cc40c5ec8a6b95317e5fe6abaca6fc',1,'cv::UMat::cols'],['https://docs.opencv.org/4.2.0/d0/db7/structcv_1_1cudev_1_1UnaryTransformPtrSz.html#a2a851b94fb1e8fc00ce6dfe7b751f3ad',1,'cv::cudev::UnaryTransformPtrSz::cols'],['https://docs.opencv.org/4.2.0/db/d9b/structcv_1_1cudev_1_1ZipPtrSz.html#a75e9833516adf7122d71e3346862c9da',1,'cv::cudev::ZipPtrSz::cols'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#abf46b7c02ec98a5b26820f79f7017b03',1,'cv::_InputArray::cols()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a66fc0bec98329378bdc5303654da5238',1,'cv::ogl::Buffer::cols()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a125aad6e3dfbc590e12b21c856282003',1,'cv::ogl::Texture2D::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::EigenBase::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< FullPivLU< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< HouseholderQR< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Inverse< PermutationType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< LLT< _MatrixType, _UpLo > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< PartialPivLU< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< PermutationWrapper< _IndicesType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SVDBase< Derived > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Transpose< MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< TriangularView< MatrixType, Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#a35475457c973a66539417b61449cbf5a',1,'Eigen::HouseholderSequence::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#ac78d2b46d4071963d3cab4a762de6129',1,'Eigen::IncompleteCholesky::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IndexedView.html#a6d5f355dd721df6d39482a04e5ffd44d',1,'Eigen::IndexedView::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#adb0a19af0c52f9f36160abe0d2de67e1',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'Eigen::PermutationBase::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'PermutationBase< PermutationWrapper< _IndicesType > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a0fc44f3781a869a3a410edd6691fd899',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'Eigen::SparseMatrix::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'SparseMatrix< Scalar >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'SparseMatrix< Scalar, ColMajor, int >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'Eigen::SparseMatrixBase::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< Transpose< MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a87730dd85f0d77de74bca724d0b21624',1,'Eigen::SparseQR::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#acf75fdb279f16d7c4907118ca3eb69ed',1,'Eigen::SPQR::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a12d7ac8a095cda817cd241f1aae2f8fb',1,'Eigen::TriangularView::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a12d7ac8a095cda817cd241f1aae2f8fb',1,'TriangularView< const Derived, Mode >::cols()']]], + ['cols_5f_1121',['cols_',['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a9b94f166f96a521cba816a650283937f',1,'cv::rgbd::RgbdNormals']]], + ['colsatcompiletime_1122',['ColsAtCompileTime',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da787f85fd67ee5985917eb2cef6e70441',1,'Eigen::DenseBase::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da787f85fd67ee5985917eb2cef6e70441',1,'DenseBase< ArrayWrapper< ExpressionType > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da787f85fd67ee5985917eb2cef6e70441',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da787f85fd67ee5985917eb2cef6e70441',1,'DenseBase< Solve< Decomposition, RhsType > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a27ba349f075d026c1f51d1ec69aa5b14',1,'Eigen::SparseMatrixBase::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a27ba349f075d026c1f51d1ec69aa5b14',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a27ba349f075d026c1f51d1ec69aa5b14',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a27ba349f075d026c1f51d1ec69aa5b14',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a27ba349f075d026c1f51d1ec69aa5b14',1,'SparseMatrixBase< Transpose< MatrixType > >::ColsAtCompileTime'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a27ba349f075d026c1f51d1ec69aa5b14',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::ColsAtCompileTime']]], + ['colspermutation_1123',['colsPermutation',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ab6ad43e6a6fb75726eae0d5499948f4a',1,'Eigen::ColPivHouseholderQR::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ab6ad43e6a6fb75726eae0d5499948f4a',1,'ColPivHouseholderQR< MatrixType >::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a601c67a4a0bbe9c7b25b885279db9ff2',1,'Eigen::CompleteOrthogonalDecomposition::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#abeda6d91e196c13d4dd8b7542fef3e17',1,'Eigen::FullPivHouseholderQR::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a4b9e6a3c7ee9326e3ae1672a109462f9',1,'Eigen::SparseLU::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a22f63d6baabc4dff27320776d9a1a3a1',1,'Eigen::SparseQR::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a6c4ad8d482dd7f23029c428dbd8e13e9',1,'Eigen::SPQR::colsPermutation()']]], + ['colstride_1124',['colStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#af8b144e79782a441448d59e00834f31a',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::colStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#af1bac522aee4402639189f387592000b',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::colStride()']]], + ['colwise_1125',['colwise',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1bdb06bdae22712b53d52adb3419a15',1,'Eigen::DenseBase::colwise()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1bdb06bdae22712b53d52adb3419a15',1,'DenseBase< ArrayWrapper< ExpressionType > >::colwise()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1bdb06bdae22712b53d52adb3419a15',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::colwise()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af1bdb06bdae22712b53d52adb3419a15',1,'DenseBase< Solve< Decomposition, RhsType > >::colwise()']]], + ['combine_1126',['combine',['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#ac95f9fffb50ea01bba71c07c526475cf',1,'cv::gapi::GKernelPackage::combine'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a9806f062f79116a09c2ed0ad9449e58f',1,'std::locale::combine()'],['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#ab3c55a390c722279ced6f56523fa01a7',1,'cv::gapi::combine(const GKernelPackage &lhs, const GKernelPackage &rhs)'],['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#a8ed430e3586586ec357daa4cdc3cc51f',1,'cv::gapi::combine(const GKernelPackage &a, const GKernelPackage &b, Ps &&... rest)']]], + ['combineddescriptor_1127',['CombinedDescriptor',['https://docs.opencv.org/4.2.0/d4/d5b/classcv_1_1stereo_1_1CombinedDescriptor.html',1,'cv::stereo::CombinedDescriptor< step_start, step_end, step_inc, nr_img, class >'],['https://docs.opencv.org/4.2.0/d4/d5b/classcv_1_1stereo_1_1CombinedDescriptor.html#ad8b335a3124478695b51b7363ee51910',1,'cv::stereo::CombinedDescriptor::CombinedDescriptor()']]], + ['comehere_1128',['comehere',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac20b315e6b2ac06929fe20ebed4ad90c',1,'cv::datasets::comehere'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac20b315e6b2ac06929fe20ebed4ad90c',1,'comehere(Global Namespace)']]], + ['commainitializer_1129',['CommaInitializer',['https://eigen.tuxfamily.org/dox/structEigen_1_1CommaInitializer.html',1,'Eigen']]], + ['command_5ft_1130',['command_t',['../structcommands_1_1command__t.html',1,'commands']]], + ['commandbase_1131',['CommandBase',['../classcommands_1_1CommandBase.html',1,'commands']]], + ['commandlineparser_1132',['CommandLineParser',['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html',1,'cv::CommandLineParser'],['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#ad0bb71c0bc9800e90bfdc44ff406293e',1,'cv::CommandLineParser::CommandLineParser(int argc, const char *const argv[], const String &keys)'],['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#a614095229293b2ab780cadd41a83313a',1,'cv::CommandLineParser::CommandLineParser(const CommandLineParser &parser)']]], + ['common_20pitfalls_1133',['Common pitfalls',['https://eigen.tuxfamily.org/dox/TopicPitfalls.html',1,'']]], + ['common_2ehpp_1134',['common.hpp',['https://docs.opencv.org/4.2.0/dc/d9d/modules_2core_2include_2opencv2_2core_2cuda_2common_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/de9/contrib_2modules_2cudev_2include_2opencv2_2cudev_2common_8hpp.html',1,'(Global Namespace)']]], + ['common_5ftype_1135',['common_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04263.html',1,'std']]], + ['common_5ftype_3c_20_5ftp_2c_20_5ftp_20_3e_1136',['common_type< _Tp, _Tp >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04263.html',1,'']]], + ['common_5ftype_3c_20_5ftypes_2e_2e_2e_20_3e_1137',['common_type< _Types... >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04263.html',1,'']]], + ['common_5ftype_5ft_1138',['common_type_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga3ef38e934006ae2422e5a7f136238d22',1,'std::common_type_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga3ef38e934006ae2422e5a7f136238d22',1,'common_type_t(Global Namespace)']]], + ['commonareainterptr_1139',['CommonAreaInterPtr',['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html',1,'cv::cudev']]], + ['commonareainterptrsz_1140',['CommonAreaInterPtrSz',['https://docs.opencv.org/4.2.0/db/d1c/structcv_1_1cudev_1_1CommonAreaInterPtrSz.html',1,'cv::cudev']]], + ['comp_5fellint_5f1_1141',['comp_ellint_1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gac559500c604c43ea943d593c9ad9d289',1,'std::comp_ellint_1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga35acc5bbe07b74718e22e5e7abe52fec',1,'std::tr1::comp_ellint_1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gac559500c604c43ea943d593c9ad9d289',1,'comp_ellint_1(_Tp __k)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga35acc5bbe07b74718e22e5e7abe52fec',1,'comp_ellint_1(_Tp __k)(Global Namespace)']]], + ['comp_5fellint_5f1f_1142',['comp_ellint_1f',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga7fb5be999a8125cf7e55e630eb8444a1',1,'std::comp_ellint_1f()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga7fb5be999a8125cf7e55e630eb8444a1',1,'comp_ellint_1f()(Global Namespace)']]], + ['comp_5fellint_5f1l_1143',['comp_ellint_1l',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga7247d3dd77c1ff5df3c059fed862dc48',1,'std::comp_ellint_1l()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga7247d3dd77c1ff5df3c059fed862dc48',1,'comp_ellint_1l()(Global Namespace)']]], + ['comp_5fellint_5f2_1144',['comp_ellint_2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga22fcc678829f0daf2de257896378e7e0',1,'std::comp_ellint_2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga67dca5d65386e74a0e2f17d842f0d450',1,'std::tr1::comp_ellint_2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga22fcc678829f0daf2de257896378e7e0',1,'comp_ellint_2(_Tp __k)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga67dca5d65386e74a0e2f17d842f0d450',1,'comp_ellint_2(_Tp __k)(Global Namespace)']]], + ['comp_5fellint_5f2f_1145',['comp_ellint_2f',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga21700f2f125c42b1f1da1f9c7eea1135',1,'std::comp_ellint_2f()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga21700f2f125c42b1f1da1f9c7eea1135',1,'comp_ellint_2f()(Global Namespace)']]], + ['comp_5fellint_5f2l_1146',['comp_ellint_2l',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga47b647ec386c8d4b18a030c97842df18',1,'std::comp_ellint_2l()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga47b647ec386c8d4b18a030c97842df18',1,'comp_ellint_2l()(Global Namespace)']]], + ['comp_5fellint_5f3_1147',['comp_ellint_3',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gad833404645e24b7f0598a640ff92d623',1,'std::comp_ellint_3()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga61ba4b9c23985c1d0ae83cf48b180231',1,'std::tr1::comp_ellint_3()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gad833404645e24b7f0598a640ff92d623',1,'comp_ellint_3(_Tp __k, _Tpn __nu)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga61ba4b9c23985c1d0ae83cf48b180231',1,'comp_ellint_3(_Tp __k, _Tpn __nu)(Global Namespace)']]], + ['comp_5fellint_5f3f_1148',['comp_ellint_3f',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga76834d3112f777703330892303267a39',1,'std::comp_ellint_3f()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga76834d3112f777703330892303267a39',1,'comp_ellint_3f()(Global Namespace)']]], + ['comp_5fellint_5f3l_1149',['comp_ellint_3l',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1ca081fee102cd0d4d6b091285e495e5',1,'std::comp_ellint_3l()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1ca081fee102cd0d4d6b091285e495e5',1,'comp_ellint_3l()(Global Namespace)']]], + ['comparator_1150',['comparator',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#afa5ae49218fbf90c102f306f618b1cf3',1,'cv::dnn_objdetect::InferBbox']]], + ['compare_1151',['compare',['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1img__hash_1_1ImgHashBase.html#a444a3e9ec792cf029385809393f84ad5',1,'cv::img_hash::ImgHashBase::compare()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a967b5317590fba87cc166bb8d03a1f2b',1,'__gnu_cxx::__versa_string::compare(const __versa_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac72042b419538e58816048f02d8a939c',1,'__gnu_cxx::__versa_string::compare(size_type __pos, size_type __n, const __versa_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a75d59248b3ce3544737ae337ec0e45e6',1,'__gnu_cxx::__versa_string::compare(size_type __pos1, size_type __n1, const __versa_string &__str, size_type __pos2, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a43985f2d884a45395bfad2efc5c6e8cf',1,'__gnu_cxx::__versa_string::compare(const _CharT *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a03ec24fe3c64fb1b05ff8e9de14c086f',1,'__gnu_cxx::__versa_string::compare(size_type __pos, size_type __n1, const _CharT *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a7e89f6009dd81acd8a93cedef5e88e65',1,'__gnu_cxx::__versa_string::compare(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'__gnu_debug::basic_string::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'__gnu_debug::basic_string::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'__gnu_debug::basic_string::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< _CharT >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< _CharT >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< _CharT >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< _CharT >::compare(const _CharT *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< _CharT >::compare(size_type __pos, size_type __n1, const _CharT *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< _CharT >::compare(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< _CharT, _Traits, _Allocator >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< _CharT, _Traits, _Allocator >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< _CharT, _Traits, _Allocator >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< _CharT, _Traits, _Allocator >::compare(const _CharT *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< _CharT, _Traits, _Allocator >::compare(size_type __pos, size_type __n1, const _CharT *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< _CharT, _Traits, _Allocator >::compare(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::compare(const _Elem *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::compare(size_type __pos, size_type __n1, const _Elem *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::compare(size_type __pos, size_type __n1, const _Elem *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< char >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< char >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< char >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< char >::compare(const char *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< char >::compare(size_type __pos, size_type __n1, const char *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< char >::compare(size_type __pos, size_type __n1, const char *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< char, char_traits< char >, _Byte_alloc >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< char, char_traits< char >, _Byte_alloc >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< char, char_traits< char >, _Byte_alloc >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< char, char_traits< char >, _Byte_alloc >::compare(const char *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::compare(size_type __pos, size_type __n1, const char *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< char, char_traits< char >, _Byte_alloc >::compare(size_type __pos, size_type __n1, const char *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< char_type, _Traits, _Alloc >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< char_type, _Traits, _Alloc >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< char_type, _Traits, _Alloc >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< char_type, _Traits, _Alloc >::compare(const char_type *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< char_type, _Traits, _Alloc >::compare(size_type __pos, size_type __n1, const char_type *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< char_type, _Traits, _Alloc >::compare(size_type __pos, size_type __n1, const char_type *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'basic_string< value_type >::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'basic_string< value_type >::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'basic_string< value_type >::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'basic_string< value_type >::compare(const value_type *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'basic_string< value_type >::compare(size_type __pos, size_type __n1, const value_type *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'basic_string< value_type >::compare(size_type __pos, size_type __n1, const value_type *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e55254a1296e57e119415607247b8f2',1,'std::basic_string::compare(const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2bd799002ba56d91f9d7da0f66a39034',1,'std::basic_string::compare(size_type __pos, size_type __n, const basic_string &__str) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a00fcb723571cc0e06c053dd40d3f9089',1,'std::basic_string::compare(size_type __pos1, size_type __n1, const basic_string &__str, size_type __pos2, size_type __n2=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a215d1d73d41a557d9615091708945db6',1,'std::basic_string::compare(const _CharT *__s) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2e70c8910f113af5e6698c105982610a',1,'std::basic_string::compare(size_type __pos, size_type __n1, const _CharT *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a30a54ee684d64bf8e2474d8b21eb1abf',1,'std::basic_string::compare(size_type __pos, size_type __n1, const _CharT *__s, size_type __n2) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ac7757ff95f04e364fc1230c2945f27fc',1,'std::collate::compare()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ac7757ff95f04e364fc1230c2945f27fc',1,'std::collate_byname::compare()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#af3e0ace5e44267f4c24c53b5a1793747',1,'std::sub_match::compare(const sub_match &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#af573275c5c3507af4d59175f72a3dfd0',1,'std::sub_match::compare(const string_type &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#a938d59ee36df109ba5d20ac59a1b90e5',1,'std::sub_match::compare(const value_type *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#af573275c5c3507af4d59175f72a3dfd0',1,'std::sub_match::compare(const string_type &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#a938d59ee36df109ba5d20ac59a1b90e5',1,'std::sub_match::compare(const value_type *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#af3e0ace5e44267f4c24c53b5a1793747',1,'sub_match< _Bi_iter >::compare(const sub_match &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#af573275c5c3507af4d59175f72a3dfd0',1,'sub_match< _Bi_iter >::compare(const string_type &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#a938d59ee36df109ba5d20ac59a1b90e5',1,'sub_match< _Bi_iter >::compare(const value_type *__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#af573275c5c3507af4d59175f72a3dfd0',1,'sub_match< _Bi_iter >::compare(const string_type &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#a938d59ee36df109ba5d20ac59a1b90e5',1,'sub_match< _Bi_iter >::compare(const value_type *__s) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga303cfb72acf8cbb36d884650c09a3a97',1,'cv::compare()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga4d41cd679f4a83862a3de71a6057db54',1,'cv::cuda::compare()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga303cfb72acf8cbb36d884650c09a3a97',1,'compare(InputArray src1, InputArray src2, OutputArray dst, int cmpop)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga4d41cd679f4a83862a3de71a6057db54',1,'compare(InputArray src1, InputArray src2, OutputArray dst, int cmpop, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/dab/group__core__hal__interface__compare.html',1,'Element-wise compare']]], + ['comparehist_1152',['compareHist',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gaf4190090efa5c47cb367cf97a9a519bd',1,'cv::compareHist(InputArray H1, InputArray H2, int method)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga41a249ba9a536bf2b47e95f8c7dd42b0',1,'cv::compareHist(const SparseMat &H1, const SparseMat &H2, int method)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gaf4190090efa5c47cb367cf97a9a519bd',1,'compareHist(InputArray H1, InputArray H2, int method)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga41a249ba9a536bf2b47e95f8c7dd42b0',1,'compareHist(const SparseMat &H1, const SparseMat &H2, int method)(Global Namespace)']]], + ['comparesegments_1153',['compareSegments',['https://docs.opencv.org/4.2.0/db/d73/classcv_1_1LineSegmentDetector.html#a9ecad1316ba3035aeffcf6d62c74d2cd',1,'cv::LineSegmentDetector']]], + ['comparison_1154',['Histogram Comparison',['https://docs.opencv.org/4.2.0/d8/dc8/tutorial_histogram_comparison.html',1,'']]], + ['comparison_20classes_1155',['Comparison Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01507.html',1,'']]], + ['compatible_20depth_20sensors_1156',['compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors'],['https://docs.opencv.org/4.2.0/d7/d6f/tutorial_kinect_openni.html',1,'Using Kinect and other OpenNI compatible depth sensors']]], + ['compensation_1157',['Exposure Compensation',['https://docs.opencv.org/4.2.0/dd/dff/group__stitching__exposure.html',1,'']]], + ['compilation_20arguments_1158',['G-API Graph Compilation Arguments',['https://docs.opencv.org/4.2.0/d9/d29/group__gapi__compile__args.html',1,'']]], + ['compilation_20for_20arm_20based_20linux_20systems_1159',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]], + ['compile_1160',['compile',['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#ab11bcc0578f9aa5ec8f8eaf6cda0dfa8',1,'cv::GComputation::compile(GMetaArgs &&in_metas, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a3c996ca8f04d5809b82191aae04a34ac',1,'cv::GComputation::compile(const Ts &... metas) -> typename std::enable_if< detail::are_meta_descrs< Ts... >::value, GCompiled >::type'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a86a31579919bfba49316f27093829abc',1,'cv::GComputation::compile(const Ts &... meta_and_compile_args) -> typename std::enable_if< detail::are_meta_descrs_but_last< Ts... >::value &&std::is_same< GCompileArgs, detail::last_type_t< Ts... > >::value, GCompiled >::type'],['https://docs.opencv.org/4.2.0/dd/d0d/classcv_1_1GComputationT_3_01R_07Args_8_8_8_08_4.html#ac03cbfa702322905fa459a2e1227c70d',1,'cv::GComputationT< R(Args...)>::compile(detail::ProtoToMetaT< Args >... inDescs)'],['https://docs.opencv.org/4.2.0/dd/d0d/classcv_1_1GComputationT_3_01R_07Args_8_8_8_08_4.html#a35d49b60a82e9b05b55cb27b4b765dc0',1,'cv::GComputationT< R(Args...)>::compile(detail::ProtoToMetaT< Args >... inDescs, GCompileArgs &&args)'],['https://docs.opencv.org/4.2.0/dd/d97/classcv_1_1GComputationT_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4.html#af1298850b3b7a5784262ab515d821967',1,'cv::GComputationT< std::tuple< R... >(Args...)>::compile(detail::ProtoToMetaT< Args >... inDescs)'],['https://docs.opencv.org/4.2.0/dd/d97/classcv_1_1GComputationT_3_01std_1_1tuple_3_01R_8_8_8_01_4_07Args_8_8_8_08_4.html#a833267fe5098a5dc5fca58fbab458d09',1,'cv::GComputationT< std::tuple< R... >(Args...)>::compile(detail::ProtoToMetaT< Args >... inDescs, GCompileArgs &&args)']]], + ['compile_5fargs_1161',['compile_args',['https://docs.opencv.org/4.2.0/d9/d29/group__gapi__compile__args.html#ga3ccf2a52953f18bb3e4c01243cc4e679',1,'cv::compile_args()'],['https://docs.opencv.org/4.2.0/d9/d29/group__gapi__compile__args.html#ga3ccf2a52953f18bb3e4c01243cc4e679',1,'compile_args()(Global Namespace)']]], + ['compileargtag_1162',['CompileArgTag',['https://docs.opencv.org/4.2.0/dd/d3d/structcv_1_1detail_1_1CompileArgTag.html',1,'cv::detail']]], + ['compileargtag_3c_20cv_3a_3agapi_3a_3agkernelpackage_20_3e_1163',['CompileArgTag< cv::gapi::GKernelPackage >',['https://docs.opencv.org/4.2.0/d5/d58/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1GKernelPackage_01_4.html',1,'cv::detail']]], + ['compileargtag_3c_20cv_3a_3agapi_3a_3agnetpackage_20_3e_1164',['CompileArgTag< cv::gapi::GNetPackage >',['https://docs.opencv.org/4.2.0/dc/dbf/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1GNetPackage_01_4.html',1,'cv::detail']]], + ['compileargtag_3c_20cv_3a_3agapi_3a_3aplaidml_3a_3aconfig_20_3e_1165',['CompileArgTag< cv::gapi::plaidml::config >',['https://docs.opencv.org/4.2.0/da/d3c/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1plaidml_1_1config_01_4.html',1,'cv::detail']]], + ['compileargtag_3c_20cv_3a_3agapi_3a_3ause_5fonly_20_3e_1166',['CompileArgTag< cv::gapi::use_only >',['https://docs.opencv.org/4.2.0/df/d53/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1use__only_01_4.html',1,'cv::detail']]], + ['compileargtag_3c_20cv_3a_3agapi_3a_3awip_3a_3adraw_3a_3afreetype_5ffont_20_3e_1167',['CompileArgTag< cv::gapi::wip::draw::freetype_font >',['https://docs.opencv.org/4.2.0/d8/da3/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1gapi_1_1wip_1_1draw_1_1freetype__font_01_4.html',1,'cv::detail']]], + ['compileargtag_3c_20cv_3a_3agraph_5fdump_5fpath_20_3e_1168',['CompileArgTag< cv::graph_dump_path >',['https://docs.opencv.org/4.2.0/d3/d64/structcv_1_1detail_1_1CompileArgTag_3_01cv_1_1graph__dump__path_01_4.html',1,'cv::detail']]], + ['compileargtag_3c_20gfluidoutputrois_20_3e_1169',['CompileArgTag< GFluidOutputRois >',['https://docs.opencv.org/4.2.0/d7/d5e/structcv_1_1detail_1_1CompileArgTag_3_01GFluidOutputRois_01_4.html',1,'cv::detail']]], + ['compileargtag_3c_20gfluidparallelfor_20_3e_1170',['CompileArgTag< GFluidParallelFor >',['https://docs.opencv.org/4.2.0/de/d5f/structcv_1_1detail_1_1CompileArgTag_3_01GFluidParallelFor_01_4.html',1,'cv::detail']]], + ['compileargtag_3c_20gfluidparalleloutputrois_20_3e_1171',['CompileArgTag< GFluidParallelOutputRois >',['https://docs.opencv.org/4.2.0/d5/dc7/structcv_1_1detail_1_1CompileArgTag_3_01GFluidParallelOutputRois_01_4.html',1,'cv::detail']]], + ['compiler_20making_20a_20wrong_20assumption_20on_20stack_20alignment_1172',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], + ['compiler_5fhints_2ehpp_1173',['compiler_hints.hpp',['https://docs.opencv.org/4.2.0/d6/d2e/compiler__hints_8hpp.html',1,'']]], + ['compileravailable_1174',['compilerAvailable',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a91136834ce5687aa8669c798402beb56',1,'cv::ocl::Device']]], + ['compilestreaming_1175',['compileStreaming',['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a53af72f7dafa8cbf416581628aaa32fd',1,'cv::GComputation::compileStreaming(GMetaArgs &&in_metas, GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a2fbcc669f338b5d5aca60d9ca95cc669',1,'cv::GComputation::compileStreaming(GCompileArgs &&args={})'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#aaadc813c176e6a992c76e51d07090cef',1,'cv::GComputation::compileStreaming(const Ts &... metas) -> typename std::enable_if< detail::are_meta_descrs< Ts... >::value, GStreamingCompiled >::type'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#aa2a3cae818b02d21ace48f348cb88a0a',1,'cv::GComputation::compileStreaming(const Ts &... meta_and_compile_args) -> typename std::enable_if< detail::are_meta_descrs_but_last< Ts... >::value &&std::is_same< GCompileArgs, detail::last_type_t< Ts... > >::value, GStreamingCompiled >::type'],['https://docs.opencv.org/4.2.0/d9/dfe/classcv_1_1GComputation.html#a731e812ec6ba458983dc10cc0df40325',1,'cv::GComputation::compileStreaming(const std::tuple< Ts... > &meta_and_compile_args, detail::Seq< IIs... >)']]], + ['compiletime_5fsettings_2eh_1176',['compiletime_settings.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00887.html',1,'']]], + ['compileworkgroupsize_1177',['compileWorkGroupSize',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a45d1fe80bed5fe85974a83d08c67ca53',1,'cv::ocl::Kernel']]], + ['completeframeaccordingtoflow_1178',['completeFrameAccordingToFlow',['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#gac7e9d9a4c1095962a1b4780b4fb859df',1,'cv::videostab::completeFrameAccordingToFlow()'],['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html#gac7e9d9a4c1095962a1b4780b4fb859df',1,'completeFrameAccordingToFlow()(Global Namespace)']]], + ['completeorthogonaldecomposition_1179',['CompleteOrthogonalDecomposition',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html',1,'Eigen::CompleteOrthogonalDecomposition< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a7ba33814fd3fdc62f6179cdcd655c679',1,'Eigen::CompleteOrthogonalDecomposition::CompleteOrthogonalDecomposition()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#afcfaf7a395f853247c23bb52b1ffb1cc',1,'Eigen::CompleteOrthogonalDecomposition::CompleteOrthogonalDecomposition(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a082295ba2aac35a8b8b9e2d46e1d7ce4',1,'Eigen::CompleteOrthogonalDecomposition::CompleteOrthogonalDecomposition(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#aa6c282dd7452ebe754024edb71bebd09',1,'Eigen::CompleteOrthogonalDecomposition::CompleteOrthogonalDecomposition(Index rows, Index cols)']]], + ['completeorthogonaldecomposition_1180',['completeOrthogonalDecomposition',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae90b6846f05bd30b8d52b66e427e3e09',1,'Eigen::MatrixBase::completeOrthogonalDecomposition()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae90b6846f05bd30b8d52b66e427e3e09',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::completeOrthogonalDecomposition()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae90b6846f05bd30b8d52b66e427e3e09',1,'MatrixBase< Solve< Decomposition, RhsType > >::completeOrthogonalDecomposition()']]], + ['completesymm_1181',['completeSymm',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6847337c0c55769e115a70e0f011b5ca',1,'cv::completeSymm()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6847337c0c55769e115a70e0f011b5ca',1,'completeSymm()(Global Namespace)']]], + ['complex_1182',['Complex',['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html',1,'cv::Complex< _Tp >'],['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#af3bec7e8907947043569bf8a366a84f0',1,'cv::Complex::Complex()'],['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#ad7d6fe6d84cff0cd7ad5e46dccdb5c1b',1,'cv::Complex::Complex(_Tp _re, _Tp _im=0)']]], + ['complex_1183',['complex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html',1,'std::complex< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00053.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a4243bd8ee861d7f2e640127085fb4c48',1,'std::complex::complex(const _Tp &__r=_Tp(), const _Tp &__i=_Tp())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a49d7da00378dd1c3bd5984ffdce09349',1,'std::complex::complex(const complex< _Up > &__z)']]], + ['complex_20numbers_1184',['Complex Numbers',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html',1,'']]], + ['complex_2eh_1185',['complex.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00002.html',1,'']]], + ['complex_3c_20double_20_3e_1186',['complex< double >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01935.html',1,'std']]], + ['complex_3c_20float_20_3e_1187',['complex< float >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01931.html',1,'std']]], + ['complex_3c_20long_20double_20_3e_1188',['complex< long double >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01939.html',1,'std']]], + ['complexd_1189',['Complexd',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3a5d93a0cbc1d360dbd3abf218bbb4ae',1,'cv::Complexd'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3a5d93a0cbc1d360dbd3abf218bbb4ae',1,'Complexd(Global Namespace)']]], + ['complexeigensolver_1190',['ComplexEigenSolver',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html',1,'Eigen::ComplexEigenSolver< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a3322a21574c61eefd450c003515ad802',1,'Eigen::ComplexEigenSolver::ComplexEigenSolver()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a748de5c1e7f730e16421e6d451437600',1,'Eigen::ComplexEigenSolver::ComplexEigenSolver(const EigenBase< InputType > &matrix, bool computeEigenvectors=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a86751f64ebcd5c554551fb5eaaa02db7',1,'Eigen::ComplexEigenSolver::ComplexEigenSolver(Index size)']]], + ['complexf_1191',['Complexf',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaab0325d447419758daf5de162ffb051f',1,'cv::Complexf'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaab0325d447419758daf5de162ffb051f',1,'Complexf(Global Namespace)']]], + ['complexmatrixtype_1192',['ComplexMatrixType',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#af61fe57877d51cfb50178f78534042f0',1,'Eigen::ComplexSchur::ComplexMatrixType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#af61fe57877d51cfb50178f78534042f0',1,'ComplexSchur< MatrixType >::ComplexMatrixType']]], + ['complexscalar_1193',['ComplexScalar',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a3604c99a69fac3bee42c88cb2b589143',1,'Eigen::ComplexEigenSolver::ComplexScalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#ae1a4713b53f821867fbad617e426832a',1,'Eigen::ComplexSchur::ComplexScalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#ae1a4713b53f821867fbad617e426832a',1,'ComplexSchur< MatrixType >::ComplexScalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a4d0b2a773357d0a6ec98e026f04002ed',1,'Eigen::EigenSolver::ComplexScalar'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#abdec07af91db1345bb4c74066e3d0ea7',1,'Eigen::GeneralizedEigenSolver::ComplexScalar']]], + ['complexschur_1194',['ComplexSchur',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html',1,'Eigen::ComplexSchur< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a9c92c6e4c33890d2d063c5c8dd22777d',1,'Eigen::ComplexSchur::ComplexSchur(const EigenBase< InputType > &matrix, bool computeU=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#ad707d9978dc36b3b15e460c2a83f4093',1,'Eigen::ComplexSchur::ComplexSchur(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a9c92c6e4c33890d2d063c5c8dd22777d',1,'ComplexSchur< MatrixType >::ComplexSchur(const EigenBase< InputType > &matrix, bool computeU=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#ad707d9978dc36b3b15e460c2a83f4093',1,'ComplexSchur< MatrixType >::ComplexSchur(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)']]], + ['complexschur_3c_20matrixtype_20_3e_1195',['ComplexSchur< MatrixType >',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html',1,'']]], + ['complexvectortype_1196',['ComplexVectorType',['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#acfd144329aca76882069da2fc5d53ef5',1,'Eigen::GeneralizedEigenSolver']]], + ['component_1197',['component',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a7fed80561a9b46a1a924ac6cb334ac85',1,'cv::Stitcher']]], + ['component_20analysis_20pca_1198',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], + ['compose_1199',['compose',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html#a4bcfdd6ada1197995073aae3f1e136ed',1,'cv::reg::Map::compose()'],['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#a1c31351af50695e92ebd870da823fdd3',1,'cv::reg::MapAffine::compose()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1reg_1_1MapProjec.html#a50def8f2eef5f2f984b331fccc401f8b',1,'cv::reg::MapProjec::compose()'],['https://docs.opencv.org/4.2.0/d4/d53/classcv_1_1reg_1_1MapShift.html#a282771bc3d4cd6fef9306c0e29c2795a',1,'cv::reg::MapShift::compose()']]], + ['compose1_1200',['compose1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga0099fa0a5f616d3bc2ba21b81902fc5f',1,'__gnu_cxx::compose1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga0099fa0a5f616d3bc2ba21b81902fc5f',1,'compose1()(Global Namespace)']]], + ['compose2_1201',['compose2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga3a4bcb8b957d6c73414c6a5eda0fef17',1,'__gnu_cxx::compose2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga3a4bcb8b957d6c73414c6a5eda0fef17',1,'compose2()(Global Namespace)']]], + ['compose_5fmotion_1202',['compose_motion',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#ad6bfe905b168b3a45ba709cd8979ecaf',1,'cv::omnidir::internal']]], + ['composepanorama_1203',['composePanorama',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a3217156f7deba256ecd7790ef34008ed',1,'cv::Stitcher::composePanorama(OutputArray pano)'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#acc8409a6b2e548de1653f0dc5c2ccb02',1,'cv::Stitcher::composePanorama(InputArrayOfArrays images, OutputArray pano)']]], + ['composert_1204',['composeRT',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga044b03d81f99370db05c52c3d0b46599',1,'cv::composeRT()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga044b03d81f99370db05c52c3d0b46599',1,'composeRT(InputArray rvec1, InputArray tvec1, InputArray rvec2, InputArray tvec2, OutputArray rvec3, OutputArray tvec3, OutputArray dr3dr1=noArray(), OutputArray dr3dt1=noArray(), OutputArray dr3dr2=noArray(), OutputArray dr3dt2=noArray(), OutputArray dt3dr1=noArray(), OutputArray dt3dt1=noArray(), OutputArray dt3dr2=noArray(), OutputArray dt3dt2=noArray())(Global Namespace)']]], + ['composite_5findex_2eh_1205',['composite_index.h',['https://docs.opencv.org/4.2.0/d1/d7b/composite__index_8h.html',1,'']]], + ['compositingresol_1206',['compositingResol',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad13d2d50b253e471fbaf041b9a044571',1,'cv::Stitcher']]], + ['composition_20functionality_1207',['G-API Drawing and composition functionality',['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'']]], + ['composition_20functions_1208',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], + ['compress_5ffeature_1209',['compress_feature',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a1b5f5c8d18a9f66f4ad78573ac81d29e',1,'cv::TrackerKCF::Params']]], + ['compressed_5finput_1210',['COMPRESSED_INPUT',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af1ea864e1c19796e6264ebb3950c0b9aae860ef9fda481bb6730e8794009c99b5',1,'cv::ml::StatModel']]], + ['compressed_5fsize_1211',['compressed_size',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#aff68ad20f63d588215fe57507b39394d',1,'cv::TrackerKCF::Params']]], + ['compressedaccessbit_1212',['CompressedAccessBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gaed0244284da47a2b8661261431173caf',1,'Eigen::CompressedAccessBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gaed0244284da47a2b8661261431173caf',1,'CompressedAccessBit(Global Namespace)']]], + ['compressedrectilinearportraitprojector_1213',['CompressedRectilinearPortraitProjector',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1detail_1_1CompressedRectilinearPortraitProjector.html',1,'cv::detail']]], + ['compressedrectilinearportraitwarper_1214',['CompressedRectilinearPortraitWarper',['https://docs.opencv.org/4.2.0/de/d9a/classcv_1_1CompressedRectilinearPortraitWarper.html',1,'cv::CompressedRectilinearPortraitWarper'],['https://docs.opencv.org/4.2.0/dd/dc8/classcv_1_1detail_1_1CompressedRectilinearPortraitWarper.html',1,'cv::detail::CompressedRectilinearPortraitWarper'],['https://docs.opencv.org/4.2.0/dd/dc8/classcv_1_1detail_1_1CompressedRectilinearPortraitWarper.html#a5ad1e730652815931dfcc74a268fc3b5',1,'cv::detail::CompressedRectilinearPortraitWarper::CompressedRectilinearPortraitWarper()'],['https://docs.opencv.org/4.2.0/de/d9a/classcv_1_1CompressedRectilinearPortraitWarper.html#ab8e275b58a1e3592528e4d72b4a6fa6a',1,'cv::CompressedRectilinearPortraitWarper::CompressedRectilinearPortraitWarper()']]], + ['compressedrectilinearprojector_1215',['CompressedRectilinearProjector',['https://docs.opencv.org/4.2.0/db/dbb/structcv_1_1detail_1_1CompressedRectilinearProjector.html',1,'cv::detail']]], + ['compressedrectilinearwarper_1216',['CompressedRectilinearWarper',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1CompressedRectilinearWarper.html',1,'cv::CompressedRectilinearWarper'],['https://docs.opencv.org/4.2.0/dd/dbe/classcv_1_1detail_1_1CompressedRectilinearWarper.html',1,'cv::detail::CompressedRectilinearWarper'],['https://docs.opencv.org/4.2.0/dd/dbe/classcv_1_1detail_1_1CompressedRectilinearWarper.html#a1d839e593941f89469c196b52117a4db',1,'cv::detail::CompressedRectilinearWarper::CompressedRectilinearWarper()'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1CompressedRectilinearWarper.html#a08636b91dd4802fb26765788c4f4e826',1,'cv::CompressedRectilinearWarper::CompressedRectilinearWarper()']]], + ['computational_20photography_1217',['Computational Photography',['https://docs.opencv.org/4.2.0/d1/d0d/group__photo.html',1,'Computational Photography'],['https://docs.opencv.org/4.2.0/d0/d07/tutorial_py_table_of_contents_photo.html',1,'Computational Photography']]], + ['computational_20photography_20photo_20module_1218',['Computational photography (photo module)',['https://docs.opencv.org/4.2.0/da/de7/tutorial_table_of_content_photo.html',1,'']]], + ['computationinfo_1219',['ComputationInfo',['https://eigen.tuxfamily.org/dox/group__enums.html#ga85fad7b87587764e5cf6b513a9e0ee5e',1,'Eigen::ComputationInfo'],['https://eigen.tuxfamily.org/dox/group__enums.html#ga85fad7b87587764e5cf6b513a9e0ee5e',1,'ComputationInfo(Global Namespace)']]], + ['compute_1220',['compute',['https://docs.opencv.org/4.2.0/d2/d60/structcv_1_1quality_1_1QualityGMSD_1_1__mat__data.html#a23ada52e22c69dea0d95aa564d38b5b2',1,'cv::quality::QualityGMSD::_mat_data::compute()'],['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a5d724db11621fa1c97b544c18a0eba57',1,'cv::quality::QualitySSIM::_mat_data::compute()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1bgsegm_1_1BackgroundSubtractorLSBPDesc.html#a480813c97c3e081c81e20ceb5cf839bf',1,'cv::bgsegm::BackgroundSubtractorLSBPDesc::compute()'],['https://docs.opencv.org/4.2.0/dc/d12/classcv_1_1face_1_1BIF.html#ae544b29b59ef4492bec632e8d82341d1',1,'cv::face::BIF::compute()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a93b1d7ddaef646567638f10d2cf01c48',1,'cv::line_descriptor::BinaryDescriptor::compute(const Mat &image, std::vector< KeyLine > &keylines, Mat &descriptors, bool returnFloatDescr=false) const'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a11360f24b8d2f6aa7b5ec62bc3a861e6',1,'cv::line_descriptor::BinaryDescriptor::compute(const std::vector< Mat > &images, std::vector< std::vector< KeyLine > > &keylines, std::vector< Mat > &descriptors, bool returnFloatDescr=false) const'],['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#ac4e1019795995a9395aded0a9c1c3ed6',1,'cv::BOWImgDescriptorExtractor::compute(InputArray image, std::vector< KeyPoint > &keypoints, OutputArray imgDescriptor, std::vector< std::vector< int > > *pointIdxsOfClusters=0, Mat *descriptors=0)'],['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#ad6fd3ce0bbe507644c0979178f2384f4',1,'cv::BOWImgDescriptorExtractor::compute(InputArray keypointDescriptors, OutputArray imgDescriptor, std::vector< std::vector< int > > *pointIdxsOfClusters=0)'],['https://docs.opencv.org/4.2.0/d8/d9f/classcv_1_1LMSolver_1_1Callback.html#a995ab645fb3a0b3c06624882fe29b4b0',1,'cv::LMSolver::Callback::compute()'],['https://docs.opencv.org/4.2.0/dd/d63/classcv_1_1cuda_1_1CornernessCriteria.html#a973a98647acb7906712004d9a8710e4a',1,'cv::cuda::CornernessCriteria::compute()'],['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1tbm_1_1CosDistance.html#a69b05979ba0e6188dd5307e47ee5ed82',1,'cv::tbm::CosDistance::compute(const cv::Mat &descr1, const cv::Mat &descr2) override'],['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1tbm_1_1CosDistance.html#a043a02276cc0b4961900c928ee362d54',1,'cv::tbm::CosDistance::compute(const std::vector< cv::Mat > &descrs1, const std::vector< cv::Mat > &descrs2) override'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#a12744f1611a374fb06ba251d9d2fec86',1,'cv::xfeatures2d::DAISY::compute(InputArray image, std::vector< KeyPoint > &keypoints, OutputArray descriptors) CV_OVERRIDE=0'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#a01b04d5e486b703c97ec62f489408219',1,'cv::xfeatures2d::DAISY::compute(InputArrayOfArrays images, std::vector< std::vector< KeyPoint > > &keypoints, OutputArrayOfArrays descriptors) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#afdd0a1606d0375f2446b75a947de6758',1,'cv::xfeatures2d::DAISY::compute(InputArray image, Rect roi, OutputArray descriptors)=0'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#a989b3fe67aadfebf4180ec85dc2cfc4d',1,'cv::xfeatures2d::DAISY::compute(InputArray image, OutputArray descriptors)=0'],['https://docs.opencv.org/4.2.0/dc/de5/classcv_1_1cuda_1_1DFT.html#a7f695268107fa3d5bf1d1b44131c9f47',1,'cv::cuda::DFT::compute()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#ab3cce8d56f4fc5e1d530b5931e1e8dc0',1,'cv::Feature2D::compute(InputArray image, std::vector< KeyPoint > &keypoints, OutputArray descriptors)'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#ad18e1027ffc8d9cffbb2d59c1d05b89e',1,'cv::Feature2D::compute(InputArrayOfArrays images, std::vector< std::vector< KeyPoint > > &keypoints, OutputArrayOfArrays descriptors)'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#ab4287267081959ec77c01269dbfcd373',1,'cv::cuda::HOG::compute()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a38cd712cd5a6d9ed0344731fcd121e8b',1,'cv::HOGDescriptor::compute()'],['https://docs.opencv.org/4.2.0/d9/dc1/classcv_1_1tbm_1_1IDescriptorDistance.html#a77e83d046f18ff6cca86ea02798dc785',1,'cv::tbm::IDescriptorDistance::compute(const cv::Mat &descr1, const cv::Mat &descr2)=0'],['https://docs.opencv.org/4.2.0/d9/dc1/classcv_1_1tbm_1_1IDescriptorDistance.html#a4fde2cf7e6e3284e863cc4fd7690d47e',1,'cv::tbm::IDescriptorDistance::compute(const std::vector< cv::Mat > &descrs1, const std::vector< cv::Mat > &descrs2)=0'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1tbm_1_1IImageDescriptor.html#ac1b41ae13e108dd34211332601227540',1,'cv::tbm::IImageDescriptor::compute(const cv::Mat &mat, cv::Mat &descr)=0'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1tbm_1_1IImageDescriptor.html#ab5900e3072b5a60ae4a5f426aba9b8f4',1,'cv::tbm::IImageDescriptor::compute(const std::vector< cv::Mat > &mats, std::vector< cv::Mat > &descrs)=0'],['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1img__hash_1_1ImgHashBase.html#ae2d9288db370089dfd8aab85d5e0b0f3',1,'cv::img_hash::ImgHashBase::compute()'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a68c714a24483a1afd1864fbac7fe2048',1,'cv::LDA::compute()'],['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1tbm_1_1MatchTemplateDistance.html#afe5fac6636bf374ea3dc84afb7617da1',1,'cv::tbm::MatchTemplateDistance::compute(const cv::Mat &descr1, const cv::Mat &descr2) override'],['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1tbm_1_1MatchTemplateDistance.html#ad26bd4ab92a6e1b771edbdf8a9560d3c',1,'cv::tbm::MatchTemplateDistance::compute(const std::vector< cv::Mat > &descrs1, const std::vector< cv::Mat > &descrs2) override'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#ad88ca6c6231d5accf4b3a595d7ebaf0c',1,'cv::rgbd::Odometry::compute(const Mat &srcImage, const Mat &srcDepth, const Mat &srcMask, const Mat &dstImage, const Mat &dstDepth, const Mat &dstMask, OutputArray Rt, const Mat &initRt=Mat()) const'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#af706a3bb35d2b69737e7f4492c4ece4f',1,'cv::rgbd::Odometry::compute(Ptr< OdometryFrame > &srcFrame, Ptr< OdometryFrame > &dstFrame, OutputArray Rt, const Mat &initRt=Mat()) const'],['https://docs.opencv.org/4.2.0/da/d83/classcv_1_1quality_1_1QualityBase.html#a9fb4f74d30937bbb9e88ec6b79c11c0f',1,'cv::quality::QualityBase::compute()'],['https://docs.opencv.org/4.2.0/d8/d99/classcv_1_1quality_1_1QualityBRISQUE.html#a011769e13ad8537dcec8f698a298ab1b',1,'cv::quality::QualityBRISQUE::compute(InputArray img) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d8/d99/classcv_1_1quality_1_1QualityBRISQUE.html#a65b0526a369edf57c03cd1f816083b44',1,'cv::quality::QualityBRISQUE::compute(InputArray img, const cv::String &model_file_path, const cv::String &range_file_path)'],['https://docs.opencv.org/4.2.0/d8/d81/classcv_1_1quality_1_1QualityGMSD.html#a4fbafa647a6fea744a1f5b632fc12c46',1,'cv::quality::QualityGMSD::compute(InputArray cmp) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d8/d81/classcv_1_1quality_1_1QualityGMSD.html#aa856e2c46c35bbe28fafc76e82e3cda6',1,'cv::quality::QualityGMSD::compute(InputArray ref, InputArray cmp, OutputArray qualityMap)'],['https://docs.opencv.org/4.2.0/d7/d80/classcv_1_1quality_1_1QualityMSE.html#a82ba740a06f48562a08517079712218c',1,'cv::quality::QualityMSE::compute(InputArrayOfArrays cmpImgs) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d7/d80/classcv_1_1quality_1_1QualityMSE.html#a0924aec83d5a487e1887b1d789fe3377',1,'cv::quality::QualityMSE::compute(InputArray ref, InputArray cmp, OutputArray qualityMap)'],['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#a4c08dcc4944fa7ae2bd9dc00607c3f1a',1,'cv::quality::QualityPSNR::compute(InputArray cmp) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#ab9616d5da0df37b5753b99ae6d36ba69',1,'cv::quality::QualityPSNR::compute(InputArray ref, InputArray cmp, OutputArray qualityMap, double maxPixelValue=QualityPSNR::MAX_PIXEL_VALUE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d9/db5/classcv_1_1quality_1_1QualitySSIM.html#a49d5ecc72e83b8876c8293244c3667e4',1,'cv::quality::QualitySSIM::compute(InputArray cmp) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d9/db5/classcv_1_1quality_1_1QualitySSIM.html#a7f1967a8334e28d8bef80fbe2f340f8c',1,'cv::quality::QualitySSIM::compute(InputArray ref, InputArray cmp, OutputArray qualityMap)'],['https://docs.opencv.org/4.2.0/d5/d34/classcv_1_1tbm_1_1ResizedImageDescriptor.html#a279de4e671330361c8e52215c8bb627e',1,'cv::tbm::ResizedImageDescriptor::compute(const cv::Mat &mat, cv::Mat &descr) override'],['https://docs.opencv.org/4.2.0/d5/d34/classcv_1_1tbm_1_1ResizedImageDescriptor.html#a7b7218ca700607c07aefaf17769f2b75',1,'cv::tbm::ResizedImageDescriptor::compute(const std::vector< cv::Mat > &mats, std::vector< cv::Mat > &descrs) override'],['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#a3e67269c9b88e72d43708222e1372655',1,'cv::cuda::StereoBeliefPropagation::compute(InputArray left, InputArray right, OutputArray disparity, Stream &stream)=0'],['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#a381446ab436269d86cf6701b85387c02',1,'cv::cuda::StereoBeliefPropagation::compute(InputArray data, OutputArray disparity, Stream &stream=Stream::Null())=0'],['https://docs.opencv.org/4.2.0/db/d8a/classcv_1_1cuda_1_1StereoBM.html#a0f968fd564212a3670daf59dce8433a6',1,'cv::cuda::StereoBM::compute()'],['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#a03f7087df1b2c618462eb98898841345',1,'cv::StereoMatcher::compute()'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#ac2abae8a2b57dff2bcfcb1077f1235c4',1,'cv::stereo::StereoMatcher::compute()'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a76f0b2044df458160292045a3d3714c6',1,'cv::SVD::compute(InputArray src, OutputArray w, OutputArray u, OutputArray vt, int flags=0)'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#aac85e0fc50c1e3c9716bb35dd7b9bcd2',1,'cv::SVD::compute(InputArray src, OutputArray w, int flags=0)'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a75e78203f975321abae4127dc4ee10df',1,'cv::SVD::compute(const Matx< _Tp, m, n > &a, Matx< _Tp, nm, 1 > &w, Matx< _Tp, m, nm > &u, Matx< _Tp, n, nm > &vt)'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a6a8081ff2e54fc43a7a844c2df58476c',1,'cv::SVD::compute(const Matx< _Tp, m, n > &a, Matx< _Tp, nm, 1 > &w)'],['https://docs.opencv.org/4.2.0/d7/da2/classcv_1_1TrackerFeature.html#a75e87cbd885ec32a493968cd1189bf28',1,'cv::TrackerFeature::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1BDCSVD.html#a4923796555b973dba9fe3f8744cac23e',1,'Eigen::BDCSVD::compute(const MatrixType &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1BDCSVD.html#a96232f52930af6006bc7dc1e58df1ba7',1,'Eigen::BDCSVD::compute(const MatrixType &matrix, unsigned int computationOptions)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#abaf5be01b1e3035a4de0b19f5b63549e',1,'Eigen::CholmodBase::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#abaf5be01b1e3035a4de0b19f5b63549e',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#abaf5be01b1e3035a4de0b19f5b63549e',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#abaf5be01b1e3035a4de0b19f5b63549e',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#abaf5be01b1e3035a4de0b19f5b63549e',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a608016776319abe8fe96b85f83c8dd3d',1,'Eigen::ColPivHouseholderQR::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a608016776319abe8fe96b85f83c8dd3d',1,'ColPivHouseholderQR< MatrixType >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#aeb7e38c6db5369f5c974f3786e94c1f0',1,'Eigen::ComplexEigenSolver::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a3543d2c286563108cd9ace672bbb1c09',1,'Eigen::ComplexSchur::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a3543d2c286563108cd9ace672bbb1c09',1,'ComplexSchur< MatrixType >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a38d032b75b3e75640e3db42e7ab20c24',1,'Eigen::EigenSolver::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a3745d70b826c12d33b8d34f26a5c96e7',1,'Eigen::FullPivHouseholderQR::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a0a3c3b1bbafa31a03567a4573ebabc79',1,'Eigen::FullPivLU::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#a275910b47dfe5f40211dcb59cfd68f3c',1,'Eigen::GeneralizedEigenSolver::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedSelfAdjointEigenSolver.html#a724764fe196612b752042692156ed023',1,'Eigen::GeneralizedSelfAdjointEigenSolver::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a239a6fd42c57aab3c0b048c47fde3004',1,'Eigen::HessenbergDecomposition::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a239a6fd42c57aab3c0b048c47fde3004',1,'HessenbergDecomposition< MatrixType >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a7966bedeebbeaa7a8fe4dd1da3797a0b',1,'Eigen::IncompleteCholesky::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteLUT.html#a488e37ab51d8ed37a297eeca521f1817',1,'Eigen::IncompleteLUT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a7dfa55c55e82d697bde227696a630914',1,'Eigen::IterativeSolverBase::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#acc7b9a4068cf7b69ae3227d217ed7efd',1,'Eigen::JacobiSVD::compute(const MatrixType &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a5dab376cc86cf0d36674bcdad4af3f5a',1,'Eigen::JacobiSVD::compute(const MatrixType &matrix, unsigned int computationOptions)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a1777488d0bde83d5f23a622bf8431ef2',1,'Eigen::LDLT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#aecb45daf711328e0804f272131142b57',1,'Eigen::LLT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLDLT.html#a7713ed923776078c7b3502edd4648215',1,'Eigen::PastixLDLT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLLT.html#a5d6c118b2723d7e88291e138a132f215',1,'Eigen::PastixLLT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PastixLU.html#acb4fddee92e3e74fd67ced0afaa99d35',1,'Eigen::PastixLU::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a2b6847964d9f1903193cc3e67c196849',1,'Eigen::RealQZ::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a2b6847964d9f1903193cc3e67c196849',1,'RealQZ< MatrixType >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a60caf9ffad11d728ea458c4dd36d0a98',1,'Eigen::RealSchur::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a60caf9ffad11d728ea458c4dd36d0a98',1,'RealSchur< MatrixType >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#adf397f6bce9f93c4b0139a47e261fc24',1,'Eigen::SelfAdjointEigenSolver::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholesky.html#a2228f0937ba77a513c907ab1c3504d42',1,'Eigen::SimplicialCholesky::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialCholeskyBase.html#a9a741744dda2261cae26cddf96a35bf0',1,'Eigen::SimplicialCholeskyBase::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a3917387194863ce995478c2dedf60e73',1,'Eigen::SimplicialLDLT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a329535cf4d5e5370cb8b5cacd8cb6a6a',1,'Eigen::SimplicialLLT::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#ad2f4e92cebb96ca75fede58f13178c24',1,'Eigen::SparseLU::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a08587fcc35e496692787f09617a9d97f',1,'Eigen::SparseQR::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a28cb3ef7914ecb6fdae1935b53f6be40',1,'Eigen::SuperLUBase::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a28cb3ef7914ecb6fdae1935b53f6be40',1,'SuperLUBase< _MatrixType, SuperILU< _MatrixType > >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a28cb3ef7914ecb6fdae1935b53f6be40',1,'SuperLUBase< _MatrixType, SuperLU< _MatrixType > >::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#acd288abb081d3b40b87e4b98cd8f6ee9',1,'Eigen::Tridiagonalization::compute()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UmfPackLU.html#a05fb2b5717ebd67e46b83439721ceee7',1,'Eigen::UmfPackLU::compute()']]], + ['compute2_1221',['compute2',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#a2c3540b57b4f74b4e87778e3cb338bb0',1,'cv::BOWImgDescriptorExtractor']]], + ['compute_5fintegral_1222',['compute_integral',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a94facf2a415987df65c1f46bc86c02cc',1,'cv::CvHaarEvaluator']]], + ['computeasync_1223',['computeAsync',['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1cuda_1_1Feature2DAsync.html#a77ebc500b04962e7df8a882557ca4ffc',1,'cv::cuda::Feature2DAsync']]], + ['computebadpixelpercent_1224',['computeBadPixelPercent',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga6db28b4258a9a820d5cf75b63cd51543',1,'cv::ximgproc::computeBadPixelPercent()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga6db28b4258a9a820d5cf75b63cd51543',1,'computeBadPixelPercent()(Global Namespace)']]], + ['computebboxstd_1225',['computeBboxStd',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaba913ce390921fb9cb212de4198665a2',1,'cv::ppf_match_3d::computeBboxStd()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaba913ce390921fb9cb212de4198665a2',1,'computeBboxStd()(Global Namespace)']]], + ['computebinarymap_1226',['computeBinaryMap',['https://docs.opencv.org/4.2.0/d5/d87/classcv_1_1saliency_1_1StaticSaliency.html#a540a87d2afadbda338b79ca1f0ea9e39',1,'cv::saliency::StaticSaliency']]], + ['computebitmaps_1227',['computeBitmaps',['https://docs.opencv.org/4.2.0/d7/db6/classcv_1_1AlignMTB.html#a05dfd95e34ecb2c02b179d0a9d790b22',1,'cv::AlignMTB']]], + ['computecorrespondepilines_1228',['computeCorrespondEpilines',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga19e3401c94c44b47c229be6e51d158b7',1,'cv::computeCorrespondEpilines()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga19e3401c94c44b47c229be6e51d158b7',1,'computeCorrespondEpilines()(Global Namespace)']]], + ['computedatamodulationterm_1229',['computeDataModulationTerm',['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1structured__light_1_1SinusoidalPattern.html#a698be96d5eda062ff2673cc98b5fe55c',1,'cv::structured_light::SinusoidalPattern']]], + ['computedirect_1230',['computeDirect',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#afe520161701f5f585bcc4cedb8657bd1',1,'Eigen::SelfAdjointEigenSolver']]], + ['computedistance_1231',['computeDistance',['https://docs.opencv.org/4.2.0/dc/dbf/classcv_1_1ShapeDistanceExtractor.html#aba29b7775eca6bd6c4b4f5e300094097',1,'cv::ShapeDistanceExtractor']]], + ['computeecc_1232',['computeECC',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gae94247c0014ff6497a3f85e60eab0a66',1,'cv::computeECC()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gae94247c0014ff6497a3f85e60eab0a66',1,'computeECC()(Global Namespace)']]], + ['computeeigenvectors_1233',['ComputeEigenvectors',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a7f7d17fba3c9bb92158e346d5979d0f4',1,'Eigen::ComputeEigenvectors'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a7f7d17fba3c9bb92158e346d5979d0f4',1,'ComputeEigenvectors(Global Namespace)']]], + ['computefeatures_1234',['computeFeatures',['https://docs.opencv.org/4.2.0/d8/d99/classcv_1_1quality_1_1QualityBRISQUE.html#a71931f138fa9b2db5109e2b50f3a8a74',1,'cv::quality::QualityBRISQUE']]], + ['computefromhessenberg_1235',['computeFromHessenberg',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a05dfbf329047aba756a844f8fe2de314',1,'Eigen::ComplexSchur::computeFromHessenberg()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a05dfbf329047aba756a844f8fe2de314',1,'ComplexSchur< MatrixType >::computeFromHessenberg()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#ac4acc917dcaddefae5f35acd2c536d65',1,'Eigen::RealSchur::computeFromHessenberg()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#ac4acc917dcaddefae5f35acd2c536d65',1,'RealSchur< MatrixType >::computeFromHessenberg()']]], + ['computefromlocalsvdvalues_1236',['computeFromLocalSVDValues',['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1bgsegm_1_1BackgroundSubtractorLSBPDesc.html#af446a314110bb16bb49100ecdb38f498',1,'cv::bgsegm::BackgroundSubtractorLSBPDesc']]], + ['computefromtridiagonal_1237',['computeFromTridiagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a297893df7098c43278d385e4d4e23fe4',1,'Eigen::SelfAdjointEigenSolver']]], + ['computefullu_1238',['ComputeFullU',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a9fa9302d510cee20c26311154937e23f',1,'Eigen::ComputeFullU'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a9fa9302d510cee20c26311154937e23f',1,'ComputeFullU(Global Namespace)']]], + ['computefullv_1239',['ComputeFullV',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a36581f7c662f7def31efd500c284f930',1,'Eigen::ComputeFullV'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a36581f7c662f7def31efd500c284f930',1,'ComputeFullV(Global Namespace)']]], + ['computegradient_1240',['computeGradient',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a1f76c51c08d69f2b8a0f079efc4bd093',1,'cv::HOGDescriptor']]], + ['computeimagefeatures_1241',['computeImageFeatures',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html#ga1e4ca67941780b89a36003eed2bb476e',1,'cv::detail::computeImageFeatures(const Ptr< Feature2D > &featuresFinder, InputArrayOfArrays images, std::vector< ImageFeatures > &features, InputArrayOfArrays masks=noArray())'],['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html#ga345c954d91511618cfb792235651963a',1,'cv::detail::computeImageFeatures(const Ptr< Feature2D > &featuresFinder, InputArray image, ImageFeatures &features, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html#ga1e4ca67941780b89a36003eed2bb476e',1,'computeImageFeatures(const Ptr< Feature2D > &featuresFinder, InputArrayOfArrays images, std::vector< ImageFeatures > &features, InputArrayOfArrays masks=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html#ga345c954d91511618cfb792235651963a',1,'computeImageFeatures(const Ptr< Feature2D > &featuresFinder, InputArray image, ImageFeatures &features, InputArray mask=noArray())(Global Namespace)']]], + ['computeimpl_1242',['computeImpl',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a998cf30a58b3c70e833167d96bc9548b',1,'cv::line_descriptor::BinaryDescriptor::computeImpl()'],['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a1cdbe9e377ebf8e8dd0ce4d70c10f01e',1,'cv::rgbd::FastICPOdometry::computeImpl()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a1c9e09d30453a7f3088d2a7d6afd495a',1,'cv::rgbd::ICPOdometry::computeImpl()'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a4cf0681bb36181a8dbb3340b0d0e667e',1,'cv::rgbd::Odometry::computeImpl()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#ad2a5f64789923118ace25a83efbaab7f',1,'cv::rgbd::RgbdICPOdometry::computeImpl()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#af50664123e41488c9b666a5c7d345b0f',1,'cv::rgbd::RgbdOdometry::computeImpl()'],['https://docs.opencv.org/4.2.0/d7/da2/classcv_1_1TrackerFeature.html#a3780ac17c97d771859509b1c04877112',1,'cv::TrackerFeature::computeImpl()'],['https://docs.opencv.org/4.2.0/d3/d4c/classcv_1_1TrackerFeatureFeature2d.html#a51992ef0c4d6f048641c92fef99641b4',1,'cv::TrackerFeatureFeature2d::computeImpl()'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a884bdbae42c796ef25e0e1abf25a1abf',1,'cv::TrackerFeatureHAAR::computeImpl()'],['https://docs.opencv.org/4.2.0/d2/da3/classcv_1_1TrackerFeatureHOG.html#a28a83e80a4789f61f13f7360a55af5e5',1,'cv::TrackerFeatureHOG::computeImpl()'],['https://docs.opencv.org/4.2.0/dc/d73/classcv_1_1TrackerFeatureLBP.html#a37df0f236629168d8c9d02ca4dbe8ae9',1,'cv::TrackerFeatureLBP::computeImpl()']]], + ['computeinplace_1243',['computeInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#adb0b963d7d8f96492904e8eda03efbf5',1,'Eigen::CompleteOrthogonalDecomposition::computeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#a3a16530338a734971fc45efb0ef9ac94',1,'Eigen::HouseholderQR::computeInPlace()']]], + ['computeinverseanddetwithcheck_1244',['computeInverseAndDetWithCheck',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7baaf2fdec0191a2166cf9fd84a2dcb2',1,'Eigen::MatrixBase::computeInverseAndDetWithCheck()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7baaf2fdec0191a2166cf9fd84a2dcb2',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::computeInverseAndDetWithCheck()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7baaf2fdec0191a2166cf9fd84a2dcb2',1,'MatrixBase< Solve< Decomposition, RhsType > >::computeInverseAndDetWithCheck()']]], + ['computeinversewithcheck_1245',['computeInverseWithCheck',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a116f3b50d2af7dbdf7473e517a5b8b0f',1,'Eigen::MatrixBase::computeInverseWithCheck()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a116f3b50d2af7dbdf7473e517a5b8b0f',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::computeInverseWithCheck()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a116f3b50d2af7dbdf7473e517a5b8b0f',1,'MatrixBase< Solve< Decomposition, RhsType > >::computeInverseWithCheck()']]], + ['computejacobian_1246',['computeJacobian',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#ad6cec91dcb4298212e91bb5a796caa00',1,'cv::omnidir::internal']]], + ['computejacobianstereo_1247',['computeJacobianStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#ae817b8128ba1943eebdb8e10503c6c0f',1,'cv::omnidir::internal']]], + ['computemaxidx_1248',['computeMaxIdx',['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#af297cd11054fd970602ca65ab1c90f4e',1,'cv::dnn::PoolingLayer']]], + ['computemeanreproerr_1249',['computeMeanReproErr',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a8c7e950ebb15a15631ef2af498728786',1,'cv::omnidir::internal::computeMeanReproErr(InputArrayOfArrays imagePoints, InputArrayOfArrays proImagePoints)'],['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a8c452345e36b893ed62b349e81f738fc',1,'cv::omnidir::internal::computeMeanReproErr(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints, InputArray K, InputArray D, double xi, InputArrayOfArrays omAll, InputArrayOfArrays tAll)']]], + ['computemeanreproerrstereo_1250',['computeMeanReproErrStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#af5ef20e9755bc2c48da36e3556c67090',1,'cv::omnidir::internal']]], + ['computemode_1251',['ComputeMode',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#af72c434adf30a6b60f977dffe3e926b0',1,'cv::cuda::DeviceInfo']]], + ['computemode_1252',['computeMode',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a23678f520226ce96c52f3df133c5e3bd',1,'cv::cuda::DeviceInfo']]], + ['computemodedefault_1253',['ComputeModeDefault',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#af72c434adf30a6b60f977dffe3e926b0a9cb256b0faff211d0f086b818627ad1b',1,'cv::cuda::DeviceInfo']]], + ['computemodeexclusive_1254',['ComputeModeExclusive',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#af72c434adf30a6b60f977dffe3e926b0aef6ab784c9893582b6d3631cce8a72db',1,'cv::cuda::DeviceInfo']]], + ['computemodeexclusiveprocess_1255',['ComputeModeExclusiveProcess',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#af72c434adf30a6b60f977dffe3e926b0a9809e20514e75a5ca802b17ae8da7169',1,'cv::cuda::DeviceInfo']]], + ['computemodeprohibited_1256',['ComputeModeProhibited',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#af72c434adf30a6b60f977dffe3e926b0a5262c70d1b04ff6a6b5471e8ffd93b35',1,'cv::cuda::DeviceInfo']]], + ['computemse_1257',['computeMSE',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaad2210013ec0118e542cb38a01cae416',1,'cv::ximgproc::computeMSE()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaad2210013ec0118e542cb38a01cae416',1,'computeMSE()(Global Namespace)']]], + ['computenmchannels_1258',['computeNMChannels',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga23fdd9364be7b67d104f814dd679fcde',1,'cv::text::computeNMChannels()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga23fdd9364be7b67d104f814dd679fcde',1,'computeNMChannels()(Global Namespace)']]], + ['computenormals_1259',['computeNormals',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gaef5ba3c97115c715298a620a145beffa',1,'cv::viz::computeNormals()'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gaef5ba3c97115c715298a620a145beffa',1,'computeNormals()(Global Namespace)']]], + ['computenormalspc3d_1260',['computeNormalsPC3d',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaa74e62c7b2a8b8a70e44e42211fd00f5',1,'cv::ppf_match_3d::computeNormalsPC3d()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gaa74e62c7b2a8b8a70e44e42211fd00f5',1,'computeNormalsPC3d()(Global Namespace)']]], + ['computeobjectimagepoints_1261',['computeObjectImagePoints',['https://docs.opencv.org/4.2.0/df/d8d/classcv_1_1randpattern_1_1RandomPatternCornerFinder.html#a4f9403aa890ab7af3a4f312fd5f28d82',1,'cv::randpattern::RandomPatternCornerFinder']]], + ['computeobjectimagepointsforsingle_1262',['computeObjectImagePointsForSingle',['https://docs.opencv.org/4.2.0/df/d8d/classcv_1_1randpattern_1_1RandomPatternCornerFinder.html#a325b35b85764b7228c595f71b1836e53',1,'cv::randpattern::RandomPatternCornerFinder']]], + ['computeorientation_1263',['computeOrientation',['https://docs.opencv.org/4.2.0/d8/d54/classcv_1_1ximgproc_1_1StructuredEdgeDetection.html#a70c5e2be7fb13e29cf46e447df1e3661',1,'cv::ximgproc::StructuredEdgeDetection::computeOrientation()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga42e4e05b414d11f3abc29612f058d249',1,'cv::sfm::computeOrientation()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga42e4e05b414d11f3abc29612f058d249',1,'computeOrientation()(Global Namespace)']]], + ['computephasemap_1264',['computePhaseMap',['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1structured__light_1_1SinusoidalPattern.html#a6062c0597d8fcba1525485157534f79b',1,'cv::structured_light::SinusoidalPattern']]], + ['computeprojectionmatrix_1265',['computeProjectionMatrix',['https://docs.opencv.org/4.2.0/dc/d3a/classcv_1_1viz_1_1Camera.html#a16a26df9d1ddf4833fb8b2a801c369cf',1,'cv::viz::Camera']]], + ['computequadraticformdistance_1266',['computeQuadraticFormDistance',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1xfeatures2d_1_1PCTSignaturesSQFD.html#aa67416b7f8f179ebebd8ad5168e0a5b2',1,'cv::xfeatures2d::PCTSignaturesSQFD']]], + ['computequadraticformdistances_1267',['computeQuadraticFormDistances',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1xfeatures2d_1_1PCTSignaturesSQFD.html#a7c5ba83c3d322c5c3d85d5b6d2af18f5',1,'cv::xfeatures2d::PCTSignaturesSQFD']]], + ['computer_20vision_1268',['CUDA-accelerated Computer Vision',['https://docs.opencv.org/4.2.0/d1/d1e/group__cuda.html',1,'']]], + ['computer_20vision_20applications_1269',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], + ['computer_20vision_20cuda_20module_1270',['GPU-Accelerated Computer Vision (cuda module)',['https://docs.opencv.org/4.2.0/da/d2c/tutorial_table_of_content_gpu.html',1,'']]], + ['computer_20vision_20programs_1271',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], + ['computerecallprecisioncurve_1272',['computeRecallPrecisionCurve',['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#gaa7cacd54220a6da4ee05748a0329b754',1,'cv::computeRecallPrecisionCurve()'],['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#gaa7cacd54220a6da4ee05748a0329b754',1,'computeRecallPrecisionCurve()(Global Namespace)']]], + ['computereplacedclassifier_1273',['computeReplacedClassifier',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a49cf4da9698a3e75286786c69ab58cc8',1,'cv::TrackerStateEstimatorAdaBoosting']]], + ['computereplaceweakestclassifier_1274',['computeReplaceWeakestClassifier',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html#a458cd33276dbb79b45d99143ce955179',1,'cv::BaseClassifier']]], + ['computerotationscaling_1275',['computeRotationScaling',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a7213fd78501c1185c4a1441e33c812d3',1,'Eigen::Transform']]], + ['computesaliency_1276',['computeSaliency',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#ad27c4adb8b6b878aa4631ec98dadc4cc',1,'cv::saliency::MotionSaliencyBinWangApr2014::computeSaliency()'],['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#a0345fd711cda978a9cb33965386fa2b1',1,'cv::saliency::ObjectnessBING::computeSaliency()'],['https://docs.opencv.org/4.2.0/d9/dcd/classcv_1_1saliency_1_1Saliency.html#aeee4f8dae6dd3201fe8569bb7c4b7e19',1,'cv::saliency::Saliency::computeSaliency()'],['https://docs.opencv.org/4.2.0/da/dd0/classcv_1_1saliency_1_1StaticSaliencyFineGrained.html#ab46ae4db7c877c44f2c855ac00a690f5',1,'cv::saliency::StaticSaliencyFineGrained::computeSaliency()'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#a715a665c991956d7fa32c19348842834',1,'cv::saliency::StaticSaliencySpectralResidual::computeSaliency()']]], + ['computesaliencyimpl_1277',['computeSaliencyImpl',['https://docs.opencv.org/4.2.0/d2/df7/classcv_1_1saliency_1_1MotionSaliency.html#a8a81ef4ddbc42ce706718b2486b9ed21',1,'cv::saliency::MotionSaliency::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a9c277bff61ccf265cf419b133930999b',1,'cv::saliency::MotionSaliencyBinWangApr2014::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/d1/d82/classcv_1_1saliency_1_1Objectness.html#acea77635e8fb8b34076539a0d84b258b',1,'cv::saliency::Objectness::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#a38767fc30c8378c4399a9781cc875c78',1,'cv::saliency::ObjectnessBING::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/d9/dcd/classcv_1_1saliency_1_1Saliency.html#ab73249792e00181f0a38ae3437da29b7',1,'cv::saliency::Saliency::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/d5/d87/classcv_1_1saliency_1_1StaticSaliency.html#aa070431141cd2edccf0a2d614f1fbd37',1,'cv::saliency::StaticSaliency::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/da/dd0/classcv_1_1saliency_1_1StaticSaliencyFineGrained.html#a019c3dc8d94c833834793c7668f5b202',1,'cv::saliency::StaticSaliencyFineGrained::computeSaliencyImpl()'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#aeb831acb9eb303231f37b71d5bb69c9d',1,'cv::saliency::StaticSaliencySpectralResidual::computeSaliencyImpl()']]], + ['computescalingrotation_1278',['computeScalingRotation',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a247b079c63f46bb652b3776484838216',1,'Eigen::Transform']]], + ['computeselectedweakclassifier_1279',['computeSelectedWeakClassifier',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a04ffcae7c5aedaeff6f73cdbc6524f45',1,'cv::TrackerStateEstimatorAdaBoosting']]], + ['computesignature_1280',['computeSignature',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a23afba0a61f447c839fbf0134af817eb',1,'cv::xfeatures2d::PCTSignatures']]], + ['computesignatures_1281',['computeSignatures',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a7e64cf57c74009277db78e99d14af4d2',1,'cv::xfeatures2d::PCTSignatures']]], + ['computeswappedclassifier_1282',['computeSwappedClassifier',['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a60bf59972bfd7a54ad334733b8b7ff29',1,'cv::TrackerStateEstimatorAdaBoosting']]], + ['computethinu_1283',['ComputeThinU',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9aa7fb4e98834788d0b1b0f2b8467d2527',1,'Eigen::ComputeThinU'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9aa7fb4e98834788d0b1b0f2b8467d2527',1,'ComputeThinU(Global Namespace)']]], + ['computethinv_1284',['ComputeThinV',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a540036417bfecf2e791a70948c227f47',1,'Eigen::ComputeThinV'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9a540036417bfecf2e791a70948c227f47',1,'ComputeThinV(Global Namespace)']]], + ['computeu_1285',['computeU',['https://eigen.tuxfamily.org/dox/classEigen_1_1BDCSVD.html#a705a7c2709e1624ccc19aa748a78d473',1,'Eigen::BDCSVD::computeU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a705a7c2709e1624ccc19aa748a78d473',1,'Eigen::JacobiSVD::computeU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a705a7c2709e1624ccc19aa748a78d473',1,'Eigen::SVDBase::computeU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a705a7c2709e1624ccc19aa748a78d473',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::computeU()']]], + ['computev_1286',['computeV',['https://eigen.tuxfamily.org/dox/classEigen_1_1BDCSVD.html#a5f12efcb791eb007d4a4890ac5255ac4',1,'Eigen::BDCSVD::computeV()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a5f12efcb791eb007d4a4890ac5255ac4',1,'Eigen::JacobiSVD::computeV()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a5f12efcb791eb007d4a4890ac5255ac4',1,'Eigen::SVDBase::computeV()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a5f12efcb791eb007d4a4890ac5255ac4',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::computeV()']]], + ['computing_20sdk_20compatible_20depth_20sensors_1287',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], + ['concat_1288',['concat',['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a431bbdb55c4aaaa669b8aa7d9fe1cf2c',1,'cv::dnn']]], + ['concatenate_1289',['concatenate',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a82684a32c8dee80e0a82d992eb5a83fa',1,'cv::Affine3::concatenate()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a82684a32c8dee80e0a82d992eb5a83fa',1,'Affine3< float >::concatenate()']]], + ['concathor_1290',['concatHor',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga332791cecc4160115bbea9449ee11657',1,'cv::gapi::concatHor(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga5518633a98c85dea0a0a5c3da4f136e0',1,'cv::gapi::concatHor(const std::vector< GMat > &v)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga332791cecc4160115bbea9449ee11657',1,'concatHor(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga5518633a98c85dea0a0a5c3da4f136e0',1,'concatHor(const std::vector< GMat > &v)(Global Namespace)']]], + ['concatlayer_1291',['ConcatLayer',['https://docs.opencv.org/4.2.0/da/d5c/classcv_1_1dnn_1_1ConcatLayer.html',1,'cv::dnn']]], + ['concatvert_1292',['concatVert',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga1cd4abced53d37ad46907283c6b3fa36',1,'cv::gapi::concatVert(const GMat &src1, const GMat &src2)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga771d3a4a7dd392e51f1f0081b09aa7ff',1,'cv::gapi::concatVert(const std::vector< GMat > &v)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga1cd4abced53d37ad46907283c6b3fa36',1,'concatVert(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga771d3a4a7dd392e51f1f0081b09aa7ff',1,'concatVert(const std::vector< GMat > &v)(Global Namespace)']]], + ['concept_5fcheck_2eh_1293',['concept_check.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00308.html',1,'']]], + ['concepts_20of_20the_20homography_20explained_20with_20code_1294',['Basic concepts of the homography explained with code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'']]], + ['concurrence_2eh_1295',['concurrence.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01043.html',1,'']]], + ['concurrency_1296',['Concurrency',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01474.html',1,'']]], + ['concurrentkernels_1297',['concurrentKernels',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a327633202acda2a492931e366ee11477',1,'cv::cuda::DeviceInfo']]], + ['cond_5fdealtor_1298',['cond_dealtor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11375.html',1,'__gnu_pbds::detail']]], + ['cond_5fdealtor_2ehpp_1299',['cond_dealtor.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01139.html',1,'']]], + ['cond_5fdtor_1300',['cond_dtor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11875.html',1,'__gnu_pbds::detail::ov_tree_map']]], + ['cond_5fkey_5fdtor_5fentry_5fdealtor_2ehpp_1301',['cond_key_dtor_entry_dealtor.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01247.html',1,'']]], + ['condition_20variables_1302',['Condition Variables',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html',1,'']]], + ['condition_5fbase_1303',['condition_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10683.html',1,'__gnu_cxx']]], + ['condition_5fvariable_1304',['condition_variable',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02051.html',1,'std::condition_variable'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00059.html',1,'(Global Namespace)']]], + ['condition_5fvariable_5fany_1305',['condition_variable_any',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02059.html',1,'std::_V2']]], + ['conditional_1306',['conditional',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03059.html',1,'std']]], + ['conditional_3c_20_5fusecache_3a_3avalue_2c_20std_3a_3abitset_3c_20_5fs_5fcache_5fsize_20_3e_2c_20_5fdummy_20_3e_1307',['conditional< _UseCache::value, std::bitset< _S_cache_size >, _Dummy >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03059.html',1,'']]], + ['conditional_5ft_1308',['conditional_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga3f79e9f15004fc524ff345fc510a2813',1,'std::conditional_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#ga3f79e9f15004fc524ff345fc510a2813',1,'conditional_t(Global Namespace)']]], + ['conditioning_1309',['Conditioning',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html',1,'']]], + ['conditioning_2ehpp_1310',['conditioning.hpp',['https://docs.opencv.org/4.2.0/d7/d09/conditioning_8hpp.html',1,'']]], + ['conf_5fhyperg_1311',['conf_hyperg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a2e17ccbbc4cbb99c987e875531d4a3de',1,'__gnu_cxx::conf_hyperg()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01550.html#afd178133d3ebc657708ad8174baf2a74',1,'std::tr1::conf_hyperg()']]], + ['conf_5fhypergf_1312',['conf_hypergf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#abd18e600aa78c3f2b2f835039506c810',1,'__gnu_cxx']]], + ['conf_5fhypergl_1313',['conf_hypergl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a0a9853f30d8fa515a12cd45a92da832e',1,'__gnu_cxx']]], + ['conf_5fthresh_5f_1314',['conf_thresh_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a7496b2ad6eb9893b7cf20a723eb4cec7',1,'cv::detail::BundleAdjusterBase']]], + ['confidence_1315',['confidence',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#aa3e33ded91e2b39e21e943436f224eeb',1,'cv::detail::MatchesInfo::confidence'],['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#ad3b345249fcadb57e5b17979fe8387f2',1,'cv::tbm::TrackedObject::confidence']]], + ['confidencemap_1316',['ConfidenceMap',['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga361525545aeac12e56c6838b97cfba87',1,'cv::ConfidenceMap'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga361525545aeac12e56c6838b97cfba87',1,'ConfidenceMap(Global Namespace)']]], + ['confidencemaps_1317',['confidenceMaps',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a95872763ec0f430e93e852fbd00fbc40',1,'cv::TrackerModel']]], + ['confidences_1318',['confidences',['https://docs.opencv.org/4.2.0/d3/d34/structcv_1_1DetectionROI.html#a5263b762e36e5e3a772fc53ae825a61b',1,'cv::DetectionROI']]], + ['config_1319',['Config',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html',1,'cv::face::FacemarkAAM::Config'],['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html#aa40a2cb0325e4f6c812d51f8b56f6f74',1,'cv::face::FacemarkAAM::Config::Config()']]], + ['config_1320',['config',['https://docs.opencv.org/4.2.0/de/d39/structcv_1_1gapi_1_1plaidml_1_1config.html',1,'cv::gapi::plaidml']]], + ['config_2eh_1321',['config.h',['https://docs.opencv.org/4.2.0/db/d16/config_8h.html',1,'']]], + ['configfile_1322',['configfile',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#ac9a1910494cbbc9142d560510d839348',1,'cv::face::FacemarkKazemi::Params']]], + ['configuration_1323',['Camera Configuration',['../cameraconfig.html',1,'']]], + ['configuration_2eprivate_2ehpp_1324',['configuration.private.hpp',['https://docs.opencv.org/4.2.0/d3/d08/configuration_8private_8hpp.html',1,'']]], + ['confthresh_1325',['confThresh',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#ae5421c7653929d73265431105631aecf',1,'cv::detail::BundleAdjusterBase']]], + ['conj_1326',['conj',['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#a6e911d2fb0bedec658406fc135f9d1a6',1,'cv::Complex::conj()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a8a413cd62a03ab2b886f3407f3fb0ea8',1,'cv::Scalar_::conj()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a8a413cd62a03ab2b886f3407f3fb0ea8',1,'Scalar_< double >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'cv::Vec::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< _Tp, 4 >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< double, 2 >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< double, 3 >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< double, 4 >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< double, GPCPatchDescriptor::nFeatures >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< double, nFeatures >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< float, 2 >::conj()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aec94e42e35b3f967f2e13c958351a266',1,'Vec< float, 3 >::conj()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga556c10b533dbb99817a60942544cb6d4',1,'std::conj()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga556c10b533dbb99817a60942544cb6d4',1,'conj()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ab84f39a06a18e1ebb23f8be80345b79d',1,'Eigen::conj()']]], + ['conjgradsolver_1327',['ConjGradSolver',['https://docs.opencv.org/4.2.0/d0/d21/classcv_1_1ConjGradSolver.html',1,'cv']]], + ['conjugate_1328',['conjugate',['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ac71fa85a4f177b0aeb1026752aea5590',1,'Eigen::HouseholderSequence::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a5e63b775d0a93161ce6137ec0a17f6b0',1,'Eigen::QuaternionBase::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a5e63b775d0a93161ce6137ec0a17f6b0',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a5e63b775d0a93161ce6137ec0a17f6b0',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a5e63b775d0a93161ce6137ec0a17f6b0',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a6671a26f31ead5f6e14d1d7d1221d9ec',1,'Eigen::SelfAdjointView::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a6671a26f31ead5f6e14d1d7d1221d9ec',1,'SelfAdjointView< const Derived, UpLo >::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a53c6a7764a6610f4955788f6134a8d78',1,'Eigen::TriangularView::conjugate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a53c6a7764a6610f4955788f6134a8d78',1,'TriangularView< const Derived, Mode >::conjugate()']]], + ['conjugategradient_1329',['ConjugateGradient',['https://eigen.tuxfamily.org/dox/classEigen_1_1ConjugateGradient.html',1,'Eigen::ConjugateGradient< class, _UpLo, class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ConjugateGradient.html#a92a9656ca9fa4da240194f89229255eb',1,'Eigen::ConjugateGradient::ConjugateGradient()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ConjugateGradient.html#ac10f778fcd137eca1f6057c8ddd3d644',1,'Eigen::ConjugateGradient::ConjugateGradient(const EigenBase< MatrixDerived > &A)']]], + ['conjugateif_1330',['conjugateIf',['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#afe117fafd579da0371861bec910599a3',1,'Eigen::HouseholderSequence::conjugateIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad50f99f2a8d8d8bb8eb79733af5fcf9b',1,'Eigen::SelfAdjointView::conjugateIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad50f99f2a8d8d8bb8eb79733af5fcf9b',1,'SelfAdjointView< const Derived, UpLo >::conjugateIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a3461c3e9ccb404c66291c298ec986af9',1,'Eigen::TriangularView::conjugateIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a3461c3e9ccb404c66291c298ec986af9',1,'TriangularView< const Derived, Mode >::conjugateIf()']]], + ['connect_1331',['connect',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a032292c7866fb72db251708b0e7c2bea',1,'cv::dnn::Net::connect(String outPin, String inpPin)'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a26615a67830b0045b68565c7e7dc1307',1,'cv::dnn::Net::connect(int outLayerId, int outNum, int inpLayerId, int inpNum)']]], + ['connectedcomponents_1332',['connectedComponents',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaedef8c7340499ca391d459122e51bef5',1,'cv::connectedComponents(InputArray image, OutputArray labels, int connectivity, int ltype, int ccltype)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gac2718a64ade63475425558aa669a943a',1,'cv::connectedComponents(InputArray image, OutputArray labels, int connectivity=8, int ltype=CV_32S)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaedef8c7340499ca391d459122e51bef5',1,'connectedComponents(InputArray image, OutputArray labels, int connectivity, int ltype, int ccltype)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gac2718a64ade63475425558aa669a943a',1,'connectedComponents(InputArray image, OutputArray labels, int connectivity=8, int ltype=CV_32S)(Global Namespace)']]], + ['connectedcomponentsalgorithmstypes_1333',['ConnectedComponentsAlgorithmsTypes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga5ed7784614678adccb699c70fb841075',1,'cv::ConnectedComponentsAlgorithmsTypes'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga5ed7784614678adccb699c70fb841075',1,'ConnectedComponentsAlgorithmsTypes(Global Namespace)']]], + ['connectedcomponentstypes_1334',['ConnectedComponentsTypes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gac7099124c0390051c6970a987e7dc5c5',1,'cv::ConnectedComponentsTypes'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gac7099124c0390051c6970a987e7dc5c5',1,'ConnectedComponentsTypes(Global Namespace)']]], + ['connectedcomponentswithstats_1335',['connectedComponentsWithStats',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga107a78bf7cd25dec05fb4dfc5c9e765f',1,'cv::connectedComponentsWithStats(InputArray image, OutputArray labels, OutputArray stats, OutputArray centroids, int connectivity, int ltype, int ccltype)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gae57b028a2b2ca327227c2399a9d53241',1,'cv::connectedComponentsWithStats(InputArray image, OutputArray labels, OutputArray stats, OutputArray centroids, int connectivity=8, int ltype=CV_32S)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga107a78bf7cd25dec05fb4dfc5c9e765f',1,'connectedComponentsWithStats(InputArray image, OutputArray labels, OutputArray stats, OutputArray centroids, int connectivity, int ltype, int ccltype)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gae57b028a2b2ca327227c2399a9d53241',1,'connectedComponentsWithStats(InputArray image, OutputArray labels, OutputArray stats, OutputArray centroids, int connectivity=8, int ltype=CV_32S)(Global Namespace)']]], + ['connectedges_1336',['connectEdges',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a3490a3d952aa7ef951a3bdb9bce3688c',1,'cv::Subdiv2D']]], + ['connections_20with_20c_1337',['Connections with C++',['https://docs.opencv.org/4.2.0/d8/dd7/group__core__c__glue.html',1,'']]], + ['connectivitymask_1338',['connectivityMask',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga9cd8a37566d3c2f2bdd83f14eb96a57d',1,'cv::cuda::connectivityMask()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga9cd8a37566d3c2f2bdd83f14eb96a57d',1,'connectivityMask()(Global Namespace)']]], + ['conservativeresize_1339',['conservativeResize',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'Eigen::PlainObjectBase::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'Eigen::PlainObjectBase::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'Eigen::PlainObjectBase::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'Eigen::PlainObjectBase::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a712c25be1652e5a64a00f28c8ed11462',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a8c9b27a1df4d180b9fb5755bebea2dbd',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index rows, NoChange_t)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a78a42a7c0be768374781f67f40c9ab0d',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afc474a09ec9704629b795d7907fb6c37',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResize(NoChange_t, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9dc538b2c1fe9027ba58f31ee83b2ff1',1,'Eigen::SparseMatrix::conservativeResize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9dc538b2c1fe9027ba58f31ee83b2ff1',1,'SparseMatrix< Scalar >::conservativeResize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9dc538b2c1fe9027ba58f31ee83b2ff1',1,'SparseMatrix< Scalar, ColMajor, int >::conservativeResize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9dc538b2c1fe9027ba58f31ee83b2ff1',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::conservativeResize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9dc538b2c1fe9027ba58f31ee83b2ff1',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::conservativeResize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#abc6d75178a429bfddd4ca4a36261f213',1,'Eigen::SparseVector::conservativeResize()']]], + ['conservativeresizelike_1340',['conservativeResizeLike',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'Eigen::PlainObjectBase::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a4ece7540eda6a1ae7d3730397ce72bec',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::conservativeResizeLike()']]], + ['consistentmosaicinpainter_1341',['ConsistentMosaicInpainter',['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1videostab_1_1ConsistentMosaicInpainter.html',1,'cv::videostab::ConsistentMosaicInpainter'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1videostab_1_1ConsistentMosaicInpainter.html#ab630d4502bf586264ec21ee342e04fa1',1,'cv::videostab::ConsistentMosaicInpainter::ConsistentMosaicInpainter()']]], + ['const_20propagating_20wrapper_1342',['Const-propagating wrapper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01526.html',1,'']]], + ['const_5finputs_1343',['const_inputs',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#abcd569505d17ebb8d373458e689b2d4d',1,'cv::gapi::ie::detail::ParamDesc']]], + ['const_5fiterator_1344',['const_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11931.html',1,'__gnu_pbds::detail::pat_trie_base::_Inode< _ATraits, Metadata >::const_iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a03ee12b0c549bc13394a274a18bd891e',1,'cv::Mat_::const_iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a03ee12b0c549bc13394a274a18bd891e',1,'Mat_< double >::const_iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a03ee12b0c549bc13394a274a18bd891e',1,'Mat_< float >::const_iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a03ee12b0c549bc13394a274a18bd891e',1,'Mat_< uchar >::const_iterator'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a03ee12b0c549bc13394a274a18bd891e',1,'Mat_< unsigned char >::const_iterator'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a4f7803d5c41eef808081903167d3a263',1,'cv::SparseMat::const_iterator'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a60cda480e8a3854c706d9f56a119c8fd',1,'cv::SparseMat_::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11363.html#aa520fee6d39690828c3ea6cf7142030d',1,'__gnu_pbds::trie_string_access_traits::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3d51d0ac851fe6c1b5d59e3b5aacfe57',1,'std::set::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3d51d0ac851fe6c1b5d59e3b5aacfe57',1,'std::set::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acb0e1b9ce26687d13dace99250f876e3',1,'std::unordered_map::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acb0e1b9ce26687d13dace99250f876e3',1,'std::unordered_map::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac98a77485a1a68eaadb6a7c8b5d4b141',1,'std::unordered_multimap::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac98a77485a1a68eaadb6a7c8b5d4b141',1,'std::unordered_multimap::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a348726f7f2783583fee4bccee78e6ff4',1,'std::unordered_multiset::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a348726f7f2783583fee4bccee78e6ff4',1,'std::unordered_multiset::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a77ac106cb24d3c809aa1dac59b508f46',1,'std::unordered_set::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a77ac106cb24d3c809aa1dac59b508f46',1,'std::unordered_set::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acb0e1b9ce26687d13dace99250f876e3',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#acb0e1b9ce26687d13dace99250f876e3',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a306d9418d4b34874e9005d961c490cd2',1,'Eigen::DenseBase::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a306d9418d4b34874e9005d961c490cd2',1,'DenseBase< ArrayWrapper< ExpressionType > >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a306d9418d4b34874e9005d961c490cd2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a306d9418d4b34874e9005d961c490cd2',1,'DenseBase< Solve< Decomposition, RhsType > >::const_iterator'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aebd2cfa7e4ded4e97cde9269bfeeea38.html#aebd2cfa7e4ded4e97cde9269bfeeea38',1,'nlohmann::basic_json::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'Eigen::VectorwiseOp::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const Derived, Horizontal >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const Derived, Vertical >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::const_iterator'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a595c33d2a82427a1159568b0b8438554',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::const_iterator']]], + ['const_5fiterator_5f_1345',['const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html',1,'const_iterator_'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#a7d6dec5709f9fa70583f65263701e9a3',1,'const_iterator_::const_iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#aefd4394ed84e098841202e80ebbd7b8b',1,'const_iterator_::const_iterator_(const_pointer_ p_value, PB_DS_GEN_POS pos, const PB_DS_CLASS_C_DEC *p_tbl)']]], + ['const_5flocal_5fiterator_1346',['const_local_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af0cb2cf999f96def015e87c3cca6691d',1,'std::unordered_map::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af0cb2cf999f96def015e87c3cca6691d',1,'std::unordered_map::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ab04f4d4643b5de9638d2f5aaa31d94e5',1,'std::unordered_multimap::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ab04f4d4643b5de9638d2f5aaa31d94e5',1,'std::unordered_multimap::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af3443472eeb3187e370e7c523c5df91e',1,'std::unordered_multiset::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af3443472eeb3187e370e7c523c5df91e',1,'std::unordered_multiset::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ad71108e3e7466e69cf84def961574aec',1,'std::unordered_set::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ad71108e3e7466e69cf84def961574aec',1,'std::unordered_set::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af0cb2cf999f96def015e87c3cca6691d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_local_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af0cb2cf999f96def015e87c3cca6691d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_local_iterator']]], + ['const_5fmem_5ffun1_5fref_5ft_1347',['const_mem_fun1_ref_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07647.html',1,'std']]], + ['const_5fmem_5ffun1_5ft_1348',['const_mem_fun1_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07639.html',1,'std']]], + ['const_5fmem_5ffun_5fref_5ft_1349',['const_mem_fun_ref_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07631.html',1,'std']]], + ['const_5fmem_5ffun_5ft_1350',['const_mem_fun_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07623.html',1,'std']]], + ['const_5fparam_5ftype_1351',['const_param_type',['https://docs.opencv.org/4.2.0/db/d0d/structcv_1_1ParamType_3_01__Tp_00_01typename_01std_1_1enable__if_3_01std_1_1is__enum_3_01__Tp_01_4_1_1value_01_4_1_1type_01_4.html#a0205eb16a28e784575cfde165f2b22ec',1,'cv::ParamType< _Tp, typename std::enable_if< std::is_enum< _Tp >::value >::type >::const_param_type'],['https://docs.opencv.org/4.2.0/d2/d39/structcv_1_1ParamType_3_01Algorithm_01_4.html#ad5a747dbd46d3d89333446fb44a11622',1,'cv::ParamType< Algorithm >::const_param_type'],['https://docs.opencv.org/4.2.0/d1/d87/structcv_1_1ParamType_3_01bool_01_4.html#a7dfbf4986b3baa8c885d1f4f9f9faa68',1,'cv::ParamType< bool >::const_param_type'],['https://docs.opencv.org/4.2.0/d4/d98/structcv_1_1ParamType_3_01double_01_4.html#af89d2dea03d58c74da4d325567e18d10',1,'cv::ParamType< double >::const_param_type'],['https://docs.opencv.org/4.2.0/dd/df2/structcv_1_1ParamType_3_01float_01_4.html#a036d463bd35228bcd55e404a19137968',1,'cv::ParamType< float >::const_param_type'],['https://docs.opencv.org/4.2.0/db/d5f/structcv_1_1ParamType_3_01Mat_01_4.html#acff1d3691c6eb064470617deb75c57e6',1,'cv::ParamType< Mat >::const_param_type'],['https://docs.opencv.org/4.2.0/d2/dda/structcv_1_1ParamType_3_01Scalar_01_4.html#a7c28a3c306ab486360b8b77398eede0c',1,'cv::ParamType< Scalar >::const_param_type'],['https://docs.opencv.org/4.2.0/dc/d1c/structcv_1_1ParamType_3_01std_1_1vector_3_01Mat_01_4_01_4.html#ab6003f7118e8f4a0fe9b82b1726547fd',1,'cv::ParamType< std::vector< Mat > >::const_param_type'],['https://docs.opencv.org/4.2.0/d0/d5f/structcv_1_1ParamType_3_01String_01_4.html#a08d838030dee6f2ffa9bcc8548514f55',1,'cv::ParamType< String >::const_param_type'],['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1ParamType_3_01uchar_01_4.html#ad5c9489f1317cc5c418a9a7b17474c21',1,'cv::ParamType< uchar >::const_param_type'],['https://docs.opencv.org/4.2.0/dc/d63/structcv_1_1ParamType_3_01uint64_01_4.html#aca86b26f06acb9d3653fa2d994a6b216',1,'cv::ParamType< uint64 >::const_param_type'],['https://docs.opencv.org/4.2.0/d7/d68/structcv_1_1ParamType_3_01unsigned_01_4.html#afe2f0ffe1293d36ed5ef2a9a535a154c',1,'cv::ParamType< unsigned >::const_param_type']]], + ['const_5fpointer_1352',['const_pointer',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a91b3cfd49759f29223b558b50fb338ba',1,'cv::Allocator::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#a8233f5369e1b6e60da547f7f1843e030',1,'__gnu_pbds::detail::binary_heap_const_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#abc8067c1b2d82a54c6836768b76f0383',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#a162def37be44e8be8c4a67ae92e99e4e',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#acd2508c18e3fd2bf7bee7f9614412b35',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a841791873537638dfc36c80ecc98bc48',1,'allocator_traits< _Tp_alloc_type >::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#a56f3879fa29a0681a004a855e77bb8e7',1,'const_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a5b919c25bd3e9c458e1023bb775c41e4',1,'iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5c4301fb32288fe246e53a9712ccdfd9',1,'point_const_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a89be73f6a8053c3a8a467f9e5b9a381c',1,'point_iterator_::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a841791873537638dfc36c80ecc98bc48',1,'std::allocator_traits::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a96c1831e637b76322672ada286c11295',1,'std::allocator_traits< allocator< _Tp > >::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3d7226decb850440d394df1dafae0984',1,'std::set::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a3d7226decb850440d394df1dafae0984',1,'std::set::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a16fbc4a1f8abfebdee17e4d6303c03a3',1,'std::unordered_map::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a16fbc4a1f8abfebdee17e4d6303c03a3',1,'std::unordered_map::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac2aca480ec930cab8cee31638ec6aa0c',1,'std::unordered_multimap::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac2aca480ec930cab8cee31638ec6aa0c',1,'std::unordered_multimap::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aa107c9adeffdf499edd13a0a88ed8cbc',1,'std::unordered_multiset::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aa107c9adeffdf499edd13a0a88ed8cbc',1,'std::unordered_multiset::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a64c2420ac682e15e195863aecf2bcb8b',1,'std::unordered_set::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a64c2420ac682e15e195863aecf2bcb8b',1,'std::unordered_set::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a16fbc4a1f8abfebdee17e4d6303c03a3',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a16fbc4a1f8abfebdee17e4d6303c03a3',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_pointer'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4108c5148f1d7cf13c2681e22f141a10.html#a4108c5148f1d7cf13c2681e22f141a10',1,'nlohmann::basic_json::const_pointer']]], + ['const_5fpointer_5fcast_1353',['const_pointer_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa2f97c555285b7c2e771b789ccd7b126',1,'std']]], + ['const_5freference_1354',['const_reference',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a3fdc48a7fe0d17cc5807500be535c150',1,'cv::Allocator::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7c469cca98a372efbd8ed9cb086fa3ae',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11631.html#a4929c6c309b332e7e61ca667d4970f34',1,'__gnu_pbds::detail::bin_search_tree_node_it_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#a157eb231eb4380523a8b4f619829787e',1,'__gnu_pbds::detail::binary_heap_const_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#ac229bf024f7824ff3c9b29333d3e2dd9',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#a21dc840b511d19faf16ba33864df72df',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a1c27f284ce4ba239912eb348bebff5c3',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#ace57cd6add9d3c9d22db7e8903ed2788',1,'const_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a6697087226a2ded72ae3aa5448c4a330',1,'iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#ae2a78ffde6504713d18b10737b777aea',1,'point_const_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a05924e3a0a7e273dcea7afecfb20dbd6',1,'point_iterator_::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a8d75c5991f7b0318f9390ed0a960a805',1,'std::set::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a8d75c5991f7b0318f9390ed0a960a805',1,'std::set::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aaa3ed5ea37fb02cd6a5eacf89409f52d',1,'std::unordered_map::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aaa3ed5ea37fb02cd6a5eacf89409f52d',1,'std::unordered_map::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a580c722f453604f50c163788a75fd6c3',1,'std::unordered_multimap::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a580c722f453604f50c163788a75fd6c3',1,'std::unordered_multimap::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ab16debc24d07c39201f4aaa943b8ba6d',1,'std::unordered_multiset::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ab16debc24d07c39201f4aaa943b8ba6d',1,'std::unordered_multiset::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a795d0f609bd9032858d61acc386ee11a',1,'std::unordered_set::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a795d0f609bd9032858d61acc386ee11a',1,'std::unordered_set::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aaa3ed5ea37fb02cd6a5eacf89409f52d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_reference'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aaa3ed5ea37fb02cd6a5eacf89409f52d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::const_reference'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab8a1c33ee7b154fc41ca2545aa9724e6.html#ab8a1c33ee7b154fc41ca2545aa9724e6',1,'nlohmann::basic_json::const_reference']]], + ['const_5freverse_5fiterator_1355',['const_reverse_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab28676718c0dc84a292b8998fa943c83',1,'std::set::const_reverse_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab28676718c0dc84a292b8998fa943c83',1,'std::set::const_reverse_iterator'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa7dba16ed9ee97380aeb17a207dd919a.html#aa7dba16ed9ee97380aeb17a207dd919a',1,'nlohmann::basic_json::const_reverse_iterator']]], + ['const_5fvoid_5fpointer_1356',['const_void_pointer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a5a9cb47519e4840523e38e45cf56bf1d',1,'__alloc_traits< _Tp_alloc_type >::const_void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a5a9cb47519e4840523e38e45cf56bf1d',1,'__gnu_cxx::__alloc_traits::const_void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a5a9cb47519e4840523e38e45cf56bf1d',1,'allocator_traits< _Tp_alloc_type >::const_void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a5a9cb47519e4840523e38e45cf56bf1d',1,'std::allocator_traits::const_void_pointer'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#aa47f11fc58f578103d6d7eb28e2fab5c',1,'std::allocator_traits< allocator< _Tp > >::const_void_pointer']]], + ['constaffinepart_1357',['ConstAffinePart',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#adfa0bf2d9504548cdc9b9051b2fa9673',1,'Eigen::Transform']]], + ['constant_1358',['CONSTANT',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a1010adb068498c191b8079323ad790f9a70a1b962f26e257cbb8715653897e20c',1,'cv::ocl::KernelArg']]], + ['constant_1359',['Constant',['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#aa91553f34d69e1c969e2e9fab0beb08f',1,'cv::ocl::KernelArg::Constant(const Mat &m)'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a357cca635048b2a6e2606f07d30efd31',1,'cv::ocl::KernelArg::Constant(const _Tp *arr, size_t n)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aed89b5cc6e3b7d9d5bd63aed245ccd6d',1,'Eigen::DenseBase::Constant(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a68a7ece6c5629d1e9447a321fcb14ccd',1,'Eigen::DenseBase::Constant(Index rows, Index cols, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1fdd3189ae3a41d250593334d82210cf',1,'Eigen::DenseBase::Constant(Index size, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aed89b5cc6e3b7d9d5bd63aed245ccd6d',1,'DenseBase< ArrayWrapper< ExpressionType > >::Constant(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a68a7ece6c5629d1e9447a321fcb14ccd',1,'DenseBase< ArrayWrapper< ExpressionType > >::Constant(Index rows, Index cols, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1fdd3189ae3a41d250593334d82210cf',1,'DenseBase< ArrayWrapper< ExpressionType > >::Constant(Index size, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aed89b5cc6e3b7d9d5bd63aed245ccd6d',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Constant(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a68a7ece6c5629d1e9447a321fcb14ccd',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Constant(Index rows, Index cols, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1fdd3189ae3a41d250593334d82210cf',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Constant(Index size, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aed89b5cc6e3b7d9d5bd63aed245ccd6d',1,'DenseBase< Solve< Decomposition, RhsType > >::Constant(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a68a7ece6c5629d1e9447a321fcb14ccd',1,'DenseBase< Solve< Decomposition, RhsType > >::Constant(Index rows, Index cols, const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a1fdd3189ae3a41d250593334d82210cf',1,'DenseBase< Solve< Decomposition, RhsType > >::Constant(Index size, const Scalar &value)']]], + ['constant_2ehpp_1360',['constant.hpp',['https://docs.opencv.org/4.2.0/d8/dbf/constant_8hpp.html',1,'']]], + ['constant0_1361',['constant0',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gabbe0a1fe70c819c69c49791fd172bbb7',1,'__gnu_cxx::constant0()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gabbe0a1fe70c819c69c49791fd172bbb7',1,'constant0()(Global Namespace)']]], + ['constant1_1362',['constant1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga00aba91be56a04a7a200f932b507c4f2',1,'__gnu_cxx::constant1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga00aba91be56a04a7a200f932b507c4f2',1,'constant1()(Global Namespace)']]], + ['constant2_1363',['constant2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gafa3404bd6e935274a6ce879dab3c8d08',1,'__gnu_cxx::constant2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gafa3404bd6e935274a6ce879dab3c8d08',1,'constant2()(Global Namespace)']]], + ['constant_5fbinary_5ffun_1364',['constant_binary_fun',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09215.html',1,'__gnu_cxx']]], + ['constant_5fsize_5fblocks_5ftag_1365',['constant_size_blocks_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09767.html',1,'__gnu_parallel']]], + ['constant_5funary_5ffun_1366',['constant_unary_fun',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09211.html',1,'__gnu_cxx']]], + ['constant_5fvoid_5ffun_1367',['constant_void_fun',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09207.html',1,'__gnu_cxx']]], + ['constantptr_1368',['ConstantPtr',['https://docs.opencv.org/4.2.0/d5/db7/structcv_1_1cudev_1_1ConstantPtr.html',1,'cv::cudev']]], + ['constantptr_1369',['constantPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b2ac61efab2ed96241275b822c57990',1,'cv::cudev::constantPtr(T value)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac972334035abee982d93c8d981ef7d31',1,'cv::cudev::constantPtr(T value, int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b2ac61efab2ed96241275b822c57990',1,'constantPtr(T value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac972334035abee982d93c8d981ef7d31',1,'constantPtr(T value, int rows, int cols)(Global Namespace)']]], + ['constantptrsz_1370',['ConstantPtrSz',['https://docs.opencv.org/4.2.0/d2/df7/structcv_1_1cudev_1_1ConstantPtrSz.html',1,'cv::cudev']]], + ['constinput_1371',['ConstInput',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#a973fed5585bc862a96339cf10f632bbb',1,'cv::gapi::ie::detail::ParamDesc']]], + ['constinput_1372',['constInput',['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#a9e18d44a58c68488dcc0cfb58543f8d7',1,'cv::gapi::ie::Params']]], + ['constlayer_1373',['ConstLayer',['https://docs.opencv.org/4.2.0/de/dff/classcv_1_1dnn_1_1ConstLayer.html',1,'cv::dnn']]], + ['constlinearpart_1374',['ConstLinearPart',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ab09f89e930e9c96e64253b4d2d9f0f36',1,'Eigen::Transform']]], + ['constmatrixtype_1375',['ConstMatrixType',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a16a3127612714bbf4edd7c2d93a8cc6b',1,'Eigen::Transform']]], + ['construct_1376',['construct',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#aaa6a7abde8485e155c045ffade9b1f84',1,'cv::Allocator::construct()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#ad96be4073167053157b3c54782457a6e',1,'__alloc_traits< _Tp_alloc_type >::construct(_Tp_alloc_type &__a, _Tp *__p, _Args &&... __args) noexcept(noexcept(_S_construct(__a, __p, std::forward< _Args >(__args)...))) -> decltype(_S_construct(__a, __p, std::forward< _Args >(__args)...))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ad96be4073167053157b3c54782457a6e',1,'__alloc_traits< _Tp_alloc_type >::construct(_Tp_alloc_type &__a, _Tp *__p, _Args &&... __args) noexcept(noexcept(_S_construct(__a, __p, std::forward< _Args >(__args)...))) -> decltype(_S_construct(__a, __p, std::forward< _Args >(__args)...))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#ad96be4073167053157b3c54782457a6e',1,'__gnu_cxx::__alloc_traits::construct(_Alloc &__a, _Tp *__p, _Args &&... __args) noexcept(noexcept(_S_construct(__a, __p, std::forward< _Args >(__args)...))) -> decltype(_S_construct(__a, __p, std::forward< _Args >(__args)...))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ad96be4073167053157b3c54782457a6e',1,'__gnu_cxx::__alloc_traits::construct(_Alloc &__a, _Tp *__p, _Args &&... __args) noexcept(noexcept(_S_construct(__a, __p, std::forward< _Args >(__args)...))) -> decltype(_S_construct(__a, __p, std::forward< _Args >(__args)...))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ad96be4073167053157b3c54782457a6e',1,'allocator_traits< _Tp_alloc_type >::construct()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ad96be4073167053157b3c54782457a6e',1,'std::allocator_traits::construct()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#aa62d702c78bb5d61c52662d227cfa647',1,'std::allocator_traits< allocator< _Tp > >::construct()']]], + ['constructor_1377',['Constructor',['https://docs.opencv.org/4.2.0/d4/d67/classcv_1_1dnn_1_1LayerFactory.html#a5a9145f3c87e3f42aa74bef2b2585fa8',1,'cv::dnn::LayerFactory']]], + ['constructvec_1378',['ConstructVec',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#aab15620c1bd731b84ed025416dbb5cf1',1,'cv::detail']]], + ['constructvelcontroller_1379',['constructVelController',['../classrobot_1_1base__motor.html#a82a29b47dc89943ca11d6455c3d43130',1,'robot::base_motor']]], + ['consttranslationpart_1380',['ConstTranslationPart',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a33ea3bc20d89eda7e642a8f3d728bf17',1,'Eigen::Transform']]], + ['container_1381',['Container',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a0cabe346c38a4f1ab1b8a396fbd2bbe2.html#a0cabe346c38a4f1ab1b8a396fbd2bbe2',1,'nlohmann::ordered_map::Container'],['https://docs.opencv.org/4.2.0/d6/d6d/tutorial_mat_the_basic_image_container.html',1,'Mat - The Basic Image Container']]], + ['container_20of_20any_20type_1382',['Type-safe container of any type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html',1,'']]], + ['container_5favi_2eprivate_2ehpp_1383',['container_avi.private.hpp',['https://docs.opencv.org/4.2.0/d2/db0/container__avi_8private_8hpp.html',1,'']]], + ['container_5fbase_5fdispatch_1384',['container_base_dispatch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11355.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_2ehpp_1385',['container_base_dispatch.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01142.html',1,'']]], + ['container_5fbase_5fdispatch_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20binary_5fheap_5ftag_2c_20null_5ftype_20_3e_1386',['container_base_dispatch< _VTp, Cmp_Fn, _Alloc, binary_heap_tag, null_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11447.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20binomial_5fheap_5ftag_2c_20null_5ftype_20_3e_1387',['container_base_dispatch< _VTp, Cmp_Fn, _Alloc, binomial_heap_tag, null_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11439.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20pairing_5fheap_5ftag_2c_20null_5ftype_20_3e_1388',['container_base_dispatch< _VTp, Cmp_Fn, _Alloc, pairing_heap_tag, null_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11435.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20rc_5fbinomial_5fheap_5ftag_2c_20null_5ftype_20_3e_1389',['container_base_dispatch< _VTp, Cmp_Fn, _Alloc, rc_binomial_heap_tag, null_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11443.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20thin_5fheap_5ftag_2c_20null_5ftype_20_3e_1390',['container_base_dispatch< _VTp, Cmp_Fn, _Alloc, thin_heap_tag, null_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11451.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20cc_5fhash_5ftag_2c_20policy_5ftl_20_3e_1391',['container_base_dispatch< Key, Mapped, _Alloc, cc_hash_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11419.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20gp_5fhash_5ftag_2c_20policy_5ftl_20_3e_1392',['container_base_dispatch< Key, Mapped, _Alloc, gp_hash_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11427.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20list_5fupdate_5ftag_2c_20policy_5ftl_20_3e_1393',['container_base_dispatch< Key, Mapped, _Alloc, list_update_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11379.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20ov_5ftree_5ftag_2c_20policy_5ftl_20_3e_1394',['container_base_dispatch< Key, Mapped, _Alloc, ov_tree_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11411.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20pat_5ftrie_5ftag_2c_20policy_5ftl_20_3e_1395',['container_base_dispatch< Key, Mapped, _Alloc, pat_trie_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11387.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20rb_5ftree_5ftag_2c_20policy_5ftl_20_3e_1396',['container_base_dispatch< Key, Mapped, _Alloc, rb_tree_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11395.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20mapped_2c_20_5falloc_2c_20splay_5ftree_5ftag_2c_20policy_5ftl_20_3e_1397',['container_base_dispatch< Key, Mapped, _Alloc, splay_tree_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11403.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20cc_5fhash_5ftag_2c_20policy_5ftl_20_3e_1398',['container_base_dispatch< Key, null_type, _Alloc, cc_hash_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11423.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20gp_5fhash_5ftag_2c_20policy_5ftl_20_3e_1399',['container_base_dispatch< Key, null_type, _Alloc, gp_hash_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11431.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20list_5fupdate_5ftag_2c_20policy_5ftl_20_3e_1400',['container_base_dispatch< Key, null_type, _Alloc, list_update_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11383.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20ov_5ftree_5ftag_2c_20policy_5ftl_20_3e_1401',['container_base_dispatch< Key, null_type, _Alloc, ov_tree_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11415.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20pat_5ftrie_5ftag_2c_20policy_5ftl_20_3e_1402',['container_base_dispatch< Key, null_type, _Alloc, pat_trie_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11391.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20rb_5ftree_5ftag_2c_20policy_5ftl_20_3e_1403',['container_base_dispatch< Key, null_type, _Alloc, rb_tree_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11399.html',1,'__gnu_pbds::detail']]], + ['container_5fbase_5fdispatch_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20splay_5ftree_5ftag_2c_20policy_5ftl_20_3e_1404',['container_base_dispatch< Key, null_type, _Alloc, splay_tree_tag, Policy_Tl >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11407.html',1,'__gnu_pbds::detail']]], + ['container_5ferror_1405',['container_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11127.html',1,'__gnu_pbds']]], + ['container_5ftag_1406',['container_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11207.html',1,'__gnu_pbds']]], + ['container_5ftraits_1407',['container_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_1408',['container_traits_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11299.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_3c_20binary_5fheap_5ftag_20_3e_1409',['container_traits_base< binary_heap_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11347.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_3c_20binomial_5fheap_5ftag_20_3e_1410',['container_traits_base< binomial_heap_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11339.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_3c_20cc_5fhash_5ftag_20_3e_1411',['container_traits_base< cc_hash_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11303.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_3c_20cntnr_3a_3acontainer_5fcategory_20_3e_1412',['container_traits_base< Cntnr::container_category >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11299.html',1,'']]], + ['container_5ftraits_5fbase_3c_20gp_5fhash_5ftag_20_3e_1413',['container_traits_base< gp_hash_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11307.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_3c_20list_5fupdate_5ftag_20_3e_1414',['container_traits_base< list_update_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11327.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_3c_20ov_5ftree_5ftag_20_3e_1415',['container_traits_base< ov_tree_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11319.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_3c_20pairing_5fheap_5ftag_20_3e_1416',['container_traits_base< pairing_heap_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11331.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_3c_20pat_5ftrie_5ftag_20_3e_1417',['container_traits_base< pat_trie_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11323.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_3c_20rb_5ftree_5ftag_20_3e_1418',['container_traits_base< rb_tree_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11311.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_3c_20rc_5fbinomial_5fheap_5ftag_20_3e_1419',['container_traits_base< rc_binomial_heap_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11343.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_3c_20splay_5ftree_5ftag_20_3e_1420',['container_traits_base< splay_tree_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11315.html',1,'__gnu_pbds']]], + ['container_5ftraits_5fbase_3c_20thin_5fheap_5ftag_20_3e_1421',['container_traits_base< thin_heap_tag >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11335.html',1,'__gnu_pbds']]], + ['container_5ftype_1422',['container_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#a07b20b41619db738d2bb3782b063be1a',1,'std::back_insert_iterator::container_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#a4308a2935935721e29e7cd725be64007',1,'std::front_insert_iterator::container_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a81ef704d3e33bcb38d894a8b1e440771',1,'std::insert_iterator::container_type'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a4d27e8633c5a5e3b49dd4ccb06515713.html#a4d27e8633c5a5e3b49dd4ccb06515713',1,'nlohmann::byte_container_with_subtype::container_type']]], + ['containers_1423',['Containers',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01469.html',1,'Containers'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01527.html',1,'Containers']]], + ['containers_20with_20eigen_1424',['Using STL Containers with Eigen',['https://eigen.tuxfamily.org/dox/group__TopicStlContainers.html',1,'']]], + ['contains_1425',['contains',['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a367d5be1a40cc9d423f765ebf2721ee8',1,'cv::Rect_::contains()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a013a78bb0e9ac3a27dc1e604435288fb',1,'Eigen::AlignedBox::contains(const AlignedBox &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a8bfd8127621e4a19032945744adf5041',1,'Eigen::AlignedBox::contains(const MatrixBase< Derived > &p) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a02c9bc4d0f33b7dec20b2798301d6971.html#a02c9bc4d0f33b7dec20b2798301d6971',1,'nlohmann::basic_json::contains(KeyT &&key) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_adb82c1f34c73486e013da71ae369e597.html#adb82c1f34c73486e013da71ae369e597',1,'nlohmann::basic_json::contains(const json_pointer &ptr) const']]], + ['context_1426',['Context',['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html',1,'cv::ocl::Context'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a2474d50e89eef07e34e82bcb5067ca8a',1,'cv::ocl::Context::Context()'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a1db64b0cb4055c0a3fbeb51fd8682bfa',1,'cv::ocl::Context::Context(int dtype)'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a2f80a4600f75bb25b511e196c331b746',1,'cv::ocl::Context::Context(const Context &c)']]], + ['contextenergy_5fspatialconstant_1427',['contextEnergy_spatialConstant',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#a21d451433f4ef6425cae730e3284c93c',1,'cv::bioinspired::SegmentationParameters']]], + ['contextenergy_5ftemporalconstant_1428',['contextEnergy_temporalConstant',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#a223120f1456f0dbbb8481653d557af1e',1,'cv::bioinspired::SegmentationParameters']]], + ['continuous_5fflag_1429',['CONTINUOUS_FLAG',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ac0da3ccbc32a8894fc03afb9cea40150a3a50403178ba15a9617f5ff341418cf9',1,'cv::Mat::CONTINUOUS_FLAG'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#abf9262de727fd7542c5bead234fc41cea84000db2750cd83ad01c344b8a5b896e',1,'cv::UMat::CONTINUOUS_FLAG']]], + ['continuoustodiscrete_1430',['continuousToDiscrete',['../namespacefilters_1_1statespace.html#adde11abc1234c3e46a3b37962e9f89c8',1,'filters::statespace']]], + ['contour_20features_1431',['Contour Features',['https://docs.opencv.org/4.2.0/dd/d49/tutorial_py_contour_features.html',1,'Contour Features'],['https://docs.opencv.org/4.2.0/dc/dcf/tutorial_js_contour_features.html',1,'Contour Features']]], + ['contour_20properties_1432',['Contour Properties',['https://docs.opencv.org/4.2.0/d1/d32/tutorial_py_contour_properties.html',1,'Contour Properties'],['https://docs.opencv.org/4.2.0/da/dc1/tutorial_js_contour_properties.html',1,'Contour Properties']]], + ['contourapproximationmodes_1433',['ContourApproximationModes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga4303f45752694956374734a03c54d5ff',1,'cv::ContourApproximationModes'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga4303f45752694956374734a03c54d5ff',1,'ContourApproximationModes(Global Namespace)']]], + ['contourarea_1434',['contourArea',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga2c759ed9f497d4a618048a2f56dc97f1',1,'cv::contourArea()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga2c759ed9f497d4a618048a2f56dc97f1',1,'contourArea()(Global Namespace)']]], + ['contourfitting_1435',['ContourFitting',['https://docs.opencv.org/4.2.0/d5/d72/classcv_1_1ximgproc_1_1ContourFitting.html',1,'cv::ximgproc::ContourFitting'],['https://docs.opencv.org/4.2.0/d5/d72/classcv_1_1ximgproc_1_1ContourFitting.html#a5e4d25365e3033d2d8113a6e1a2c2db1',1,'cv::ximgproc::ContourFitting::ContourFitting()']]], + ['contours_1436',['contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'Creating Bounding boxes and circles for contours'],['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'Creating Bounding rotated boxes and ellipses for contours']]], + ['contours_20_3a_20getting_20started_1437',['Contours : Getting Started',['https://docs.opencv.org/4.2.0/d4/d73/tutorial_py_contours_begin.html',1,'Contours : Getting Started'],['https://docs.opencv.org/4.2.0/d5/daa/tutorial_js_contours_begin.html',1,'Contours : Getting Started']]], + ['contours_20_3a_20more_20functions_1438',['Contours : More Functions',['https://docs.opencv.org/4.2.0/d5/d45/tutorial_py_contours_more_functions.html',1,'Contours : More Functions'],['https://docs.opencv.org/4.2.0/d8/d1c/tutorial_js_contours_more_functions.html',1,'Contours : More Functions']]], + ['contours_20hierarchy_1439',['Contours Hierarchy',['https://docs.opencv.org/4.2.0/d9/d8b/tutorial_py_contours_hierarchy.html',1,'Contours Hierarchy'],['https://docs.opencv.org/4.2.0/da/d0a/tutorial_js_contours_hierarchy.html',1,'Contours Hierarchy']]], + ['contours_20in_20opencv_1440',['Contours in OpenCV',['https://docs.opencv.org/4.2.0/d3/d05/tutorial_py_table_of_contents_contours.html',1,'']]], + ['contours_20in_20opencv_20js_1441',['Contours in OpenCV.js',['https://docs.opencv.org/4.2.0/d0/d43/tutorial_js_table_of_contents_contours.html',1,'']]], + ['contours_20in_20your_20image_1442',['Finding contours in your image',['https://docs.opencv.org/4.2.0/df/d0d/tutorial_find_contours.html',1,'']]], + ['contours_5fmatch_5fi1_1443',['CONTOURS_MATCH_I1',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaf2b97a230b51856d09a2d934b78c015fa73b8cbe851905080a1d918c902253dcc',1,'cv::CONTOURS_MATCH_I1'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaf2b97a230b51856d09a2d934b78c015fa73b8cbe851905080a1d918c902253dcc',1,'CONTOURS_MATCH_I1(Global Namespace)']]], + ['contours_5fmatch_5fi2_1444',['CONTOURS_MATCH_I2',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaf2b97a230b51856d09a2d934b78c015faf511a9b06dc4776cc1ea1afe0fd5e7c1',1,'cv::CONTOURS_MATCH_I2'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaf2b97a230b51856d09a2d934b78c015faf511a9b06dc4776cc1ea1afe0fd5e7c1',1,'CONTOURS_MATCH_I2(Global Namespace)']]], + ['contours_5fmatch_5fi3_1445',['CONTOURS_MATCH_I3',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaf2b97a230b51856d09a2d934b78c015fae704cd6566d3576e6083657a8ac0792a',1,'cv::CONTOURS_MATCH_I3'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ggaf2b97a230b51856d09a2d934b78c015fae704cd6566d3576e6083657a8ac0792a',1,'CONTOURS_MATCH_I3(Global Namespace)']]], + ['contoursampling_1446',['contourSampling',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#ga7f51db9e952d4292a3b80bcc12b9fec9',1,'cv::ximgproc::contourSampling()'],['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#ga7f51db9e952d4292a3b80bcc12b9fec9',1,'contourSampling(InputArray src, OutputArray out, int nbElt)(Global Namespace)']]], + ['contrast_20and_20brightness_20of_20an_20image_1447',['Changing the contrast and brightness of an image!',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'']]], + ['contrast_20preserving_20decolorization_1448',['Contrast Preserving Decolorization',['https://docs.opencv.org/4.2.0/d4/d32/group__photo__decolor.html',1,'']]], + ['contrib_20modules_1449',['Tutorials for contrib modules',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_contrib_root.html',1,'']]], + ['contrib_5ftutorials_2emarkdown_1450',['contrib_tutorials.markdown',['https://docs.opencv.org/4.2.0/dd/df3/contrib__tutorials_8markdown.html',1,'']]], + ['controlmatrix_1451',['controlMatrix',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a6486e7287114810636fb33953280ed52',1,'cv::KalmanFilter']]], + ['conversions_1452',['Color Space Conversions',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html',1,'']]], + ['conversions_1453',['Color conversions',['https://docs.opencv.org/4.2.0/de/d25/imgproc_color_conversions.html',1,'']]], + ['convert_1454',['convert',['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a6bdc0b45d2a340a7a1dd8d6f9bce4bda',1,'cv::CascadeClassifier::convert()'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#aff325883052e446bb7a4cc85775beaa6',1,'cv::cuda::CascadeClassifier::convert()'],['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1cuda_1_1Feature2DAsync.html#a7d062860cbfaf1db00d1a42965b17324',1,'cv::cuda::Feature2DAsync::convert()'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#acfcc8e0dd1a634a7583686e18d372237',1,'cv::KeyPoint::convert(const std::vector< KeyPoint > &keypoints, std::vector< Point2f > &points2f, const std::vector< int > &keypointIndexes=std::vector< int >())'],['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#ab6a67a0ab17d65a1b28502eba424bfde',1,'cv::KeyPoint::convert(const std::vector< Point2f > &points2f, std::vector< KeyPoint > &keypoints, float size=1, float response=1, int octave=0, int class_id=-1)']]], + ['convert_2ehpp_1455',['convert.hpp',['https://docs.opencv.org/4.2.0/df/d32/convert_8hpp.html',1,'']]], + ['converted_1456',['converted',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a06c03e1e866769c8165776f85cc02fb7',1,'std::wstring_convert']]], + ['converters_1457',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], + ['convertfp16_1458',['convertFp16',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9c25d9ef44a2a48ecc3774b30cb80082',1,'cv::convertFp16()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gaa1c52258763197958eb9e6681917f723',1,'cv::cuda::convertFp16()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gaa1c52258763197958eb9e6681917f723',1,'convertFp16(InputArray _src, OutputArray _dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9c25d9ef44a2a48ecc3774b30cb80082',1,'convertFp16(InputArray src, OutputArray dst)(Global Namespace)']]], + ['convertfrombuffer_1459',['convertFromBuffer',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gaf7698360b08aa452c2692296ce55bccd',1,'cv::ocl::convertFromBuffer()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gaf7698360b08aa452c2692296ce55bccd',1,'convertFromBuffer()(Global Namespace)']]], + ['convertfromd3d10texture2d_1460',['convertFromD3D10Texture2D',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga46cdc3c6cc25fdef7321a923b040f046',1,'cv::directx::convertFromD3D10Texture2D()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga46cdc3c6cc25fdef7321a923b040f046',1,'convertFromD3D10Texture2D()(Global Namespace)']]], + ['convertfromd3d11texture2d_1461',['convertFromD3D11Texture2D',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#gaaea63f9b492b4a84e1e9ef6d4eba377c',1,'cv::directx::convertFromD3D11Texture2D()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#gaaea63f9b492b4a84e1e9ef6d4eba377c',1,'convertFromD3D11Texture2D()(Global Namespace)']]], + ['convertfromdirect3dsurface9_1462',['convertFromDirect3DSurface9',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga657f9cc740fe38fb0eb16df075224c2d',1,'cv::directx::convertFromDirect3DSurface9()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga657f9cc740fe38fb0eb16df075224c2d',1,'convertFromDirect3DSurface9()(Global Namespace)']]], + ['convertfromgltexture2d_1463',['convertFromGLTexture2D',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#gad2a559f1b93a89fa4936948f4c4c4bb2',1,'cv::ogl::convertFromGLTexture2D()'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#gad2a559f1b93a89fa4936948f4c4c4bb2',1,'convertFromGLTexture2D()(Global Namespace)']]], + ['convertfromimage_1464',['convertFromImage',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gada97cc08c31e416b957e23b480334b6c',1,'cv::ocl::convertFromImage()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gada97cc08c31e416b957e23b480334b6c',1,'convertFromImage()(Global Namespace)']]], + ['convertfromvasurface_1465',['convertFromVASurface',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html#ga6147e41eb1e1ab2631eeed53252c0735',1,'cv::va_intel::convertFromVASurface()'],['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html#ga6147e41eb1e1ab2631eeed53252c0735',1,'convertFromVASurface(VADisplay display, VASurfaceID surface, Size size, OutputArray dst)(Global Namespace)']]], + ['converting_20image_20from_20one_20color_20space_20to_20another_1466',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], + ['convertmaps_1467',['convertMaps',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga9156732fa8f01be9ebd1a194f2728b7f',1,'cv::convertMaps()'],['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html#ga9156732fa8f01be9ebd1a194f2728b7f',1,'convertMaps()(Global Namespace)']]], + ['converto3dray_1468',['converTo3DRay',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a6a49dc343b4f85fa243d0888926b4f31',1,'cv::viz::Viz3d']]], + ['convertpointsfromhomogeneous_1469',['convertPointsFromHomogeneous',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gac42edda3a3a0f717979589fcd6ac0035',1,'cv::convertPointsFromHomogeneous()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gac42edda3a3a0f717979589fcd6ac0035',1,'convertPointsFromHomogeneous()(Global Namespace)']]], + ['convertpointshomogeneous_1470',['convertPointsHomogeneous',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gafa5aa3f40a472bda956b4c27bec67438',1,'cv::convertPointsHomogeneous()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gafa5aa3f40a472bda956b4c27bec67438',1,'convertPointsHomogeneous()(Global Namespace)']]], + ['convertpointstohomogeneous_1471',['convertPointsToHomogeneous',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga13159f129eec8a7d9bd8501f012d5543',1,'cv::convertPointsToHomogeneous()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga13159f129eec8a7d9bd8501f012d5543',1,'convertPointsToHomogeneous()(Global Namespace)']]], + ['convertscaleabs_1472',['convertScaleAbs',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3460e9c9f37b563ab9dd550c4d8c4e7d',1,'cv::convertScaleAbs()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3460e9c9f37b563ab9dd550c4d8c4e7d',1,'convertScaleAbs()(Global Namespace)']]], + ['convertto_1473',['convertTo',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a3a1b076e54d8a8503014e27a5440d98a',1,'cv::cuda::GpuMat::convertTo(OutputArray dst, int rtype) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a079d3d6541bb2fe6127c8f5d58953c9c',1,'cv::cuda::GpuMat::convertTo(OutputArray dst, int rtype, Stream &stream) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a656ac1f6a1426527f838c19e2d677dc0',1,'cv::cuda::GpuMat::convertTo(OutputArray dst, int rtype, double alpha, double beta=0.0) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a54f6bde0a55552bc80a48ecbc8e272d6',1,'cv::cuda::GpuMat::convertTo(OutputArray dst, int rtype, double alpha, Stream &stream) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a408e9ba5344ab7d3aa27323774de118e',1,'cv::cuda::GpuMat::convertTo(OutputArray dst, int rtype, double alpha, double beta, Stream &stream) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#adf88c60c5b4980e05bb556080916978b',1,'cv::Mat::convertTo()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a577ea9bbc02ffcf195df6d96f9c9650c',1,'cv::SparseMat::convertTo(SparseMat &m, int rtype, double alpha=1) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a668825b1d0bb87a075cc2382692093b7',1,'cv::SparseMat::convertTo(Mat &m, int rtype, double alpha=1, double beta=0) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a6f11287e53debd8d460fc053dc88feaa',1,'cv::UMat::convertTo()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gae972b2c91904d36e92ee14a6778db82e',1,'cv::gapi::convertTo()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gae972b2c91904d36e92ee14a6778db82e',1,'convertTo()(Global Namespace)']]], + ['converttod3d10texture2d_1474',['convertToD3D10Texture2D',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga96bb00cac7698f2fdb7001057f9e4352',1,'cv::directx::convertToD3D10Texture2D()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga96bb00cac7698f2fdb7001057f9e4352',1,'convertToD3D10Texture2D()(Global Namespace)']]], + ['converttod3d11texture2d_1475',['convertToD3D11Texture2D',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga92b6817beb98d9cdd71280420e3da8e3',1,'cv::directx::convertToD3D11Texture2D()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga92b6817beb98d9cdd71280420e3da8e3',1,'convertToD3D11Texture2D()(Global Namespace)']]], + ['converttodirect3dsurface9_1476',['convertToDirect3DSurface9',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga45c2557af043bc17b9491503fc669a2d',1,'cv::directx::convertToDirect3DSurface9()'],['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html#ga45c2557af043bc17b9491503fc669a2d',1,'convertToDirect3DSurface9()(Global Namespace)']]], + ['converttodmatches_1477',['convertToDMatches',['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a0752ace1e8e0c46af9531ffdda0b37ee',1,'cv::FlannBasedMatcher']]], + ['converttogltexture2d_1478',['convertToGLTexture2D',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga5ab4018bf271aecf8b7144e46ff363e9',1,'cv::ogl::convertToGLTexture2D()'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ga5ab4018bf271aecf8b7144e46ff363e9',1,'convertToGLTexture2D()(Global Namespace)']]], + ['converttovasurface_1479',['convertToVASurface',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html#ga870965de4f91f2b054c6f974c65faa66',1,'cv::va_intel::convertToVASurface()'],['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html#ga870965de4f91f2b054c6f974c65faa66',1,'convertToVASurface()(Global Namespace)']]], + ['converttowindowcoordinates_1480',['convertToWindowCoordinates',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a36ca28b59f640bca8485a371e8269d71',1,'cv::viz::Viz3d']]], + ['converttuple_1481',['ConvertTuple',['https://docs.opencv.org/4.2.0/d9/d6a/structcv_1_1cudev_1_1ConvertTuple.html',1,'cv::cudev']]], + ['converttypestr_1482',['convertTypeStr',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga6af5cc5165cd65ae41925d6d95f0f7ae',1,'cv::ocl::convertTypeStr()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga6af5cc5165cd65ae41925d6d95f0f7ae',1,'convertTypeStr(int sdepth, int ddepth, int cn, char *buf)(Global Namespace)']]], + ['convex_20hull_1483',['Convex Hull',['https://docs.opencv.org/4.2.0/d7/d1d/tutorial_hull.html',1,'']]], + ['convex_5fhull_5fratio_1484',['convex_hull_ratio',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#ac2403bf2c45570b42a544f8a63052374',1,'cv::text::ERStat']]], + ['convexhull_1485',['convexHull',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga014b28e56cb8854c0de4a211cb2be656',1,'cv::convexHull()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga014b28e56cb8854c0de4a211cb2be656',1,'convexHull()(Global Namespace)']]], + ['convexhullfactor_1486',['convexHullFactor',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#ade182b1b8720f853fd771a4f94e4b494',1,'cv::CirclesGridFinderParameters']]], + ['convexitydefects_1487',['convexityDefects',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gada4437098113fd8683c932e0567f47ba',1,'cv::convexityDefects()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gada4437098113fd8683c932e0567f47ba',1,'convexityDefects()(Global Namespace)']]], + ['convolution_1488',['Convolution',['https://docs.opencv.org/4.2.0/d4/d25/classcv_1_1cuda_1_1Convolution.html',1,'cv::cuda']]], + ['convolutionlayer_1489',['ConvolutionLayer',['https://docs.opencv.org/4.2.0/d5/dcf/classcv_1_1dnn_1_1ConvolutionLayer.html',1,'cv::dnn']]], + ['convolve_1490',['convolve',['https://docs.opencv.org/4.2.0/d4/d25/classcv_1_1cuda_1_1Convolution.html#a5b7be73953386b725ba57b961a387886',1,'cv::cuda::Convolution']]], + ['copy_1491',['copy',['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#a3e21a51c4abc87e28025ebdfca98ca3d',1,'cv::MatAllocator::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ad4a99dc8d3755b195b89f4d0e2b5bb49',1,'__gnu_cxx::__versa_string::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< _CharT >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< _CharT, _Traits, _Allocator >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< char >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< char, char_traits< char >, _Byte_alloc >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< char_type, _Traits, _Alloc >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'basic_string< value_type >::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a58b4af90a328f86db6bed2c8e25b4fe5',1,'std::basic_string::copy()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gae64ecdff179420eeacb6c9734a444265',1,'cv::gapi::copy()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gae64ecdff179420eeacb6c9734a444265',1,'copy()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga894f503412130680dc19c87af289f4f4',1,'std::copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga894f503412130680dc19c87af289f4f4',1,'copy(_II __first, _II __last, _OI __result)(Global Namespace)']]], + ['copy_2ehpp_1492',['copy.hpp',['https://docs.opencv.org/4.2.0/d7/deb/copy_8hpp.html',1,'']]], + ['copy2d_1493',['copy2D',['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#ae6c1f0dc401821c42231e42b53ee2f6d',1,'NCVMatrix']]], + ['copy_5fbackward_1494',['copy_backward',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaf0de0305e64a82131960e2769624a740',1,'std::copy_backward()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaf0de0305e64a82131960e2769624a740',1,'copy_backward()(Global Namespace)']]], + ['copy_5fif_1495',['copy_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga0450d291c012c315181300fb83de8501',1,'std::copy_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga0450d291c012c315181300fb83de8501',1,'copy_if()(Global Namespace)']]], + ['copy_5fn_1496',['copy_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga72c21e0f95b2b3cb6ea2785ee4108b01',1,'__gnu_cxx::copy_n()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga6b6a2a5b1c55fb141030b8e6c8aad212',1,'std::copy_n()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga6b6a2a5b1c55fb141030b8e6c8aad212',1,'copy_n(_InputIterator __first, _Size __n, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#ga72c21e0f95b2b3cb6ea2785ee4108b01',1,'copy_n(_InputIterator __first, _Size __count, _OutputIterator __result)(Global Namespace)']]], + ['copy_5fon_5fmap_1497',['COPY_ON_MAP',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12a89c987098b1da2337f707fbbb118951f',1,'cv::UMatData']]], + ['copy_5foptions_1498',['copy_options',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298',1,]]], + ['copy_5fsymlinks_1499',['copy_symlinks',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a47a66bb90cd48feed3eafa4b77690ffe',1,'copy_symlinks(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a47a66bb90cd48feed3eafa4b77690ffe',1,'copy_symlinks(Global Namespace)']]], + ['copycoeff_1500',['copyCoeff',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a0abe130a9130ac6df16f3c8c55490b43',1,'Eigen::TriangularBase::copyCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a0abe130a9130ac6df16f3c8c55490b43',1,'TriangularBase< SelfAdjointView< _MatrixType, UpLo > >::copyCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a0abe130a9130ac6df16f3c8c55490b43',1,'TriangularBase< SelfAdjointView< const Derived, UpLo > >::copyCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a0abe130a9130ac6df16f3c8c55490b43',1,'TriangularBase< TriangularView< _MatrixType, _Mode > >::copyCoeff()']]], + ['copyfmt_1501',['copyfmt',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'basic_ios< char, _Traits >::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'basic_iostream< char >::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'basic_istream< char >::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'basic_istream< char, _Traits >::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'basic_ostream< char >::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'basic_ostream< char, _Traits >::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_fstream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_ifstream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_ios::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_iostream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_istream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_istringstream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_ofstream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_ostream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_ostringstream::copyfmt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a57af447fc663746ea14bea76e80f5990',1,'std::basic_stringstream::copyfmt()']]], + ['copyfrom_1502',['copyFrom',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#adac4c20b821703eba30e68e3bba511a4',1,'cv::ogl::Buffer::copyFrom(InputArray arr, Target target=ARRAY_BUFFER, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#ae9a8b9910ae4f914faa7ad740e3d084f',1,'cv::ogl::Buffer::copyFrom(InputArray arr, cuda::Stream &stream, Target target=ARRAY_BUFFER, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#ab245ff921eb30efd321afc65e12960ec',1,'cv::ogl::Texture2D::copyFrom()']]], + ['copymakeborder_1503',['copyMakeBorder',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga2ac1049c2c3dd25c2b41bffe17658a36',1,'cv::copyMakeBorder()'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga5368db7656eacf846b40089c98053a49',1,'cv::cuda::copyMakeBorder()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga2ac1049c2c3dd25c2b41bffe17658a36',1,'copyMakeBorder(InputArray src, OutputArray dst, int top, int bottom, int left, int right, int borderType, const Scalar &value=Scalar())(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga5368db7656eacf846b40089c98053a49',1,'copyMakeBorder(InputArray src, OutputArray dst, int top, int bottom, int left, int right, int borderType, Scalar value=Scalar(), Stream &stream=Stream::Null())(Global Namespace)']]], + ['copymakeborder_2emarkdown_1504',['copyMakeBorder.markdown',['https://docs.opencv.org/4.2.0/d5/dca/copyMakeBorder_8markdown.html',1,'']]], + ['copyonmap_1505',['copyOnMap',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#ae5183bcbc64aa706848ef32401e4b202',1,'cv::UMatData']]], + ['copysize_1506',['copySize',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a39fd9880fc55b7a0993bcfff88061ac4',1,'cv::Mat::copySize()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a2ea1c1537ee15db8b22e34218a372f5f',1,'cv::UMat::copySize()']]], + ['copysolid_1507',['copySolid',['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#a1738e37856fbcbaf171f2741aa56cce3',1,'NCVMatrix::copySolid()'],['https://docs.opencv.org/4.2.0/dc/d73/classNCVVector.html#a0ddfc4f2f76b19e88bc9c69ce87404be',1,'NCVVector::copySolid()']]], + ['copyto_1508',['copyTo',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a938c12fa2b73e6aea81017fe8d31526e',1,'cv::_InputArray::copyTo(const _OutputArray &arr) const'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a20f3875b298bcd5d17a0a7e068f4518a',1,'cv::_InputArray::copyTo(const _OutputArray &arr, const _InputArray &mask) const'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a3aab3acc565ead059f4da0efb943db0a',1,'cv::ogl::Buffer::copyTo(OutputArray arr) const'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a563a63b77bd1c01b1bed7ea7740391c1',1,'cv::ogl::Buffer::copyTo(OutputArray arr, cuda::Stream &stream) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a948c562ee340c0678a44884bde1f5a3e',1,'cv::cuda::GpuMat::copyTo(OutputArray dst) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#adf64af21a2bb13276269584c2a6e1b81',1,'cv::cuda::GpuMat::copyTo(OutputArray dst, Stream &stream) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ad47f7b0aaf53fa904a6381e7d0192145',1,'cv::cuda::GpuMat::copyTo(OutputArray dst, InputArray mask) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a49b74a0ef2076543de438fadde55de7b',1,'cv::cuda::GpuMat::copyTo(OutputArray dst, InputArray mask, Stream &stream) const'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#ab133c13641d53944f48bb925f6d96cb1',1,'cv::HOGDescriptor::copyTo()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a33fd5d125b4c302b0c9aa86980791a77',1,'cv::Mat::copyTo(OutputArray m) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a626fe5f96d02525e2604d2ad46dd574f',1,'cv::Mat::copyTo(OutputArray m, InputArray mask) const'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a47cb530df8c61d0b3dfb7c7d3c240bfd',1,'cv::gapi::own::Mat::copyTo()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a18d9fb50fa768fd20e9f11b003906133',1,'cv::SparseMat::copyTo(SparseMat &m) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a6b077b6ec96d3aa588ef32e63cd7f7f5',1,'cv::SparseMat::copyTo(Mat &m) const'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1fbf47dc67b22fccbef45c20caba947e',1,'cv::ogl::Texture2D::copyTo()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ab9f4b02e099696dc0fb43c85c6f4a2f1',1,'cv::UMat::copyTo(OutputArray m) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a9f97eb1b8c307b5cd4c17962af27efbf',1,'cv::UMat::copyTo(OutputArray m, InputArray mask) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga931a49489330f998452fc53e96e1719a',1,'cv::copyTo()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga931a49489330f998452fc53e96e1719a',1,'copyTo()(Global Namespace)']]], + ['copytohost_1509',['copyToHost',['https://docs.opencv.org/4.2.0/df/d7b/classcv_1_1dnn_1_1BackendWrapper.html#a06535a9363a71053aba8e328a75a6612',1,'cv::dnn::BackendWrapper']]], + ['core_1510',['NPPST Core',['https://docs.opencv.org/4.2.0/d5/ddd/group__core__npp.html',1,'']]], + ['core_20functionality_1511',['Core functionality',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html',1,'Core functionality'],['https://docs.opencv.org/4.2.0/df/d1f/group__gapi__core.html',1,'G-API Core functionality']]], + ['core_20functionality_20core_20module_1512',['The Core Functionality (core module)',['https://docs.opencv.org/4.2.0/de/d7a/tutorial_table_of_content_core.html',1,'']]], + ['core_20module_1513',['Core module',['https://eigen.tuxfamily.org/dox/group__Core__Module.html',1,'']]], + ['core_20module_1514',['The Core Functionality (core module)',['https://docs.opencv.org/4.2.0/de/d7a/tutorial_table_of_content_core.html',1,'']]], + ['core_20operations_1515',['Core Operations',['https://docs.opencv.org/4.2.0/d7/d16/tutorial_py_table_of_contents_core.html',1,'Core Operations'],['https://docs.opencv.org/4.2.0/d1/d78/tutorial_js_table_of_contents_core.html',1,'Core Operations']]], + ['core_20operations_20on_20matrices_1516',['Core Operations on Matrices',['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'']]], + ['core_20part_1517',['Core part',['https://docs.opencv.org/4.2.0/d7/d05/group__cudacore.html',1,'']]], + ['core_2ehpp_1518',['core.hpp',['https://docs.opencv.org/4.2.0/d2/ddb/core_2include_2opencv2_2core_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d9c/core_2include_2opencv2_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/df9/gapi_2include_2opencv2_2gapi_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/df2/gapi_2include_2opencv2_2gapi_2cpu_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d81/gapi_2include_2opencv2_2gapi_2fluid_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d1a/gapi_2include_2opencv2_2gapi_2gpu_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/db3/gapi_2include_2opencv2_2gapi_2ocl_2core_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d2d/gapi_2include_2opencv2_2gapi_2plaidml_2core_8hpp.html',1,'(Global Namespace)']]], + ['core_5fdetect_2ehpp_1519',['core_detect.hpp',['https://docs.opencv.org/4.2.0/dd/d1b/core__detect_8hpp.html',1,'']]], + ['corner_1520',['corner',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a09619d632dd6979e9d09738493221d55',1,'Eigen::AlignedBox']]], + ['corner_20detection_1521',['Corner Detection',['https://docs.opencv.org/4.2.0/df/d0c/tutorial_py_fast.html',1,'FAST Algorithm for Corner Detection'],['https://docs.opencv.org/4.2.0/dc/d0d/tutorial_py_features_harris.html',1,'Harris Corner Detection']]], + ['corner_20detector_1522',['corner detector',['https://docs.opencv.org/4.2.0/d9/dbc/tutorial_generic_corner_detector.html',1,'Creating your own corner detector'],['https://docs.opencv.org/4.2.0/d4/d7d/tutorial_harris_detector.html',1,'Harris corner detector'],['https://docs.opencv.org/4.2.0/d8/dd8/tutorial_good_features_to_track.html',1,'Shi-Tomasi corner detector']]], + ['corner_20detector_20good_20features_20to_20track_1523',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], + ['corner_5frefine_5fapriltag_1524',['CORNER_REFINE_APRILTAG',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6a3e940dda27d11e803b40b51bde40f2c5',1,'cv::aruco::CORNER_REFINE_APRILTAG'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6a3e940dda27d11e803b40b51bde40f2c5',1,'CORNER_REFINE_APRILTAG(Global Namespace)']]], + ['corner_5frefine_5fcontour_1525',['CORNER_REFINE_CONTOUR',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6abef4b459cc329a3ab839773c0805e66a',1,'cv::aruco::CORNER_REFINE_CONTOUR'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6abef4b459cc329a3ab839773c0805e66a',1,'CORNER_REFINE_CONTOUR(Global Namespace)']]], + ['corner_5frefine_5fnone_1526',['CORNER_REFINE_NONE',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6adaab47b5a6c1a9519c31cd911799f397',1,'cv::aruco::CORNER_REFINE_NONE'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6adaab47b5a6c1a9519c31cd911799f397',1,'CORNER_REFINE_NONE(Global Namespace)']]], + ['corner_5frefine_5fsubpix_1527',['CORNER_REFINE_SUBPIX',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6a62ae78cbc223dfe552c99adbc9002e5b',1,'cv::aruco::CORNER_REFINE_SUBPIX'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggafce26321f39d331bc12032a72b90eda6a62ae78cbc223dfe552c99adbc9002e5b',1,'CORNER_REFINE_SUBPIX(Global Namespace)']]], + ['corner_5fsubpixels_2emarkdown_1528',['corner_subpixels.markdown',['https://docs.opencv.org/4.2.0/dc/d29/corner__subpixels_8markdown.html',1,'']]], + ['cornereigenvalsandvecs_1529',['cornerEigenValsAndVecs',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga4055896d9ef77dd3cacf2c5f60e13f1c',1,'cv::cornerEigenValsAndVecs()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga4055896d9ef77dd3cacf2c5f60e13f1c',1,'cornerEigenValsAndVecs()(Global Namespace)']]], + ['cornerharris_1530',['cornerHarris',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gac1fc3598018010880e370e2f709b4345',1,'cv::cornerHarris()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gac1fc3598018010880e370e2f709b4345',1,'cornerHarris()(Global Namespace)']]], + ['cornermineigenval_1531',['cornerMinEigenVal',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga3dbce297c1feb859ee36707e1003e0a8',1,'cv::cornerMinEigenVal()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga3dbce297c1feb859ee36707e1003e0a8',1,'cornerMinEigenVal()(Global Namespace)']]], + ['cornernesscriteria_1532',['CornernessCriteria',['https://docs.opencv.org/4.2.0/dd/d63/classcv_1_1cuda_1_1CornernessCriteria.html',1,'cv::cuda']]], + ['cornerrefinementmaxiterations_1533',['cornerRefinementMaxIterations',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a65d86818818aee18f8646d2fdb8170d8',1,'cv::aruco::DetectorParameters']]], + ['cornerrefinementmethod_1534',['cornerRefinementMethod',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#aacfce88ccc0b5b494e002c9d63848760',1,'cv::aruco::DetectorParameters']]], + ['cornerrefinementminaccuracy_1535',['cornerRefinementMinAccuracy',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a2641f13e4f8a25403c828eee5c77a8dd',1,'cv::aruco::DetectorParameters']]], + ['cornerrefinementwinsize_1536',['cornerRefinementWinSize',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a21ff1cd9084c3695bc0b1d043d5b3bca',1,'cv::aruco::DetectorParameters']]], + ['cornerrefinemethod_1537',['CornerRefineMethod',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gafce26321f39d331bc12032a72b90eda6',1,'cv::aruco::CornerRefineMethod'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gafce26321f39d331bc12032a72b90eda6',1,'CornerRefineMethod(Global Namespace)']]], + ['corners_1538',['Detection of ChArUco Corners',['https://docs.opencv.org/4.2.0/df/d4a/tutorial_charuco_detection.html',1,'']]], + ['corners_20location_20in_20subpixels_1539',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], + ['corners_5f_1540',['corners_',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a73b7891ed68d55b25011fbcdb6d5f4da',1,'cv::detail::PairwiseSeamFinder']]], + ['cornersdetector_1541',['CornersDetector',['https://docs.opencv.org/4.2.0/de/d95/classcv_1_1cuda_1_1CornersDetector.html',1,'cv::cuda']]], + ['cornersubpix_1542',['cornerSubPix',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga354e0d7c86d0d9da75de9b9701a9a87e',1,'cv::cornerSubPix()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga354e0d7c86d0d9da75de9b9701a9a87e',1,'cornerSubPix()(Global Namespace)']]], + ['cornertype_1543',['CornerType',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378',1,'Eigen::AlignedBox']]], + ['corr_1544',['corr',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga4e5c90ed9b9e3e509adbf2bb834c272a',1,'cv::stereo::Match::corr'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga4e5c90ed9b9e3e509adbf2bb834c272a',1,'corr(Global Namespace)']]], + ['correct_1545',['correct',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a60eb7feb569222ad0657ef1875884b5e',1,'cv::KalmanFilter::correct()'],['https://docs.opencv.org/4.2.0/de/d72/classcv_1_1tracking_1_1UnscentedKalmanFilter.html#a11ecf6a0d437bea991949b8d243ca598',1,'cv::tracking::UnscentedKalmanFilter::correct()'],['../classfilters_1_1ExtendedKalmanFilter.html#a5c64d08bb61f55a50c3a45951a4bd478',1,'filters::ExtendedKalmanFilter::correct()'],['../classfilters_1_1KalmanFilter.html#aac101e5a7fbfbeeb0a33dbbe227130ff',1,'filters::KalmanFilter::correct()']]], + ['correctmatches_1546',['correctMatches',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaf32c99d17908e175ac71e7a08fad587b',1,'cv::correctMatches()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaf32c99d17908e175ac71e7a08fad587b',1,'correctMatches()(Global Namespace)']]], + ['correlationthreshold_1547',['correlationThreshold',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gabcfaaffa086614f85be49ceddcad328f',1,'cv::stereo::PropagationParameters::correlationThreshold'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gabcfaaffa086614f85be49ceddcad328f',1,'correlationThreshold(Global Namespace)']]], + ['correspondance_20algorithms_1548',['Stereo Correspondance Algorithms',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html',1,'']]], + ['correspondence_1549',['Stereo Correspondence',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html',1,'']]], + ['corrwinsizex_1550',['corrWinSizeX',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga70b71f71badb30717fbf5aeaa0d30a2f',1,'cv::stereo::PropagationParameters::corrWinSizeX'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga70b71f71badb30717fbf5aeaa0d30a2f',1,'corrWinSizeX(Global Namespace)']]], + ['corrwinsizey_1551',['corrWinSizeY',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga793edfcbae69a2fb3222d83b87add541',1,'cv::stereo::PropagationParameters::corrWinSizeY'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga793edfcbae69a2fb3222d83b87add541',1,'corrWinSizeY(Global Namespace)']]], + ['cos_1552',['cos',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a34d626eb756bbeb4069d1eb0e6494c65',1,'Eigen::MatrixBase::cos()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a34d626eb756bbeb4069d1eb0e6494c65',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::cos()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a34d626eb756bbeb4069d1eb0e6494c65',1,'MatrixBase< Solve< Decomposition, RhsType > >::cos()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga164d580371866184ddc96fa7aaf47085',1,'cv::cos()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2591489e47c1cb227d235872e4b5e433',1,'cv::cudev::cos(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb0891a2bcca020e132440ee65a5c607',1,'cv::cudev::cos(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35043d3aba80393fbfb32088aaf844c',1,'cv::cudev::cos(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dfd969175f09a6e3cdb929446c7fb33',1,'cv::cudev::cos(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9cf8a788be723f41335cecd9153c099',1,'cv::cudev::cos(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5c2f77b57c0110f99e599da242727e9',1,'cv::cudev::cos(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72652522912e6ad566ab1fa77866e5f3',1,'cv::cudev::cos(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66f81aade259c34ab035cacd0cc37bc1',1,'cv::cudev::cos(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22d5c772cab063db3d2f9c2031b69445',1,'cv::cudev::cos(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92d6a089d3dbe7ea3295a8c99e21d73e',1,'cv::cudev::cos(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8be3c68d3db47d895ebf224d360f6c8',1,'cv::cudev::cos(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fef66cbf46ebf3ef532230121b1a0b5',1,'cv::cudev::cos(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b4d98b7371281aa2a10348ba246eb3d',1,'cv::cudev::cos(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb0d2b5daa4ea3a0f189f9650963a32c',1,'cv::cudev::cos(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga255d10d58f7597c1578be436742fe543',1,'cv::cudev::cos(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga731341b35da58834dc18c6753a8da14a',1,'cv::cudev::cos(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b03de2befefa2bdbffec33deeed31a6',1,'cv::cudev::cos(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ad62c2d0b78462811fd8667fbd8481',1,'cv::cudev::cos(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0c5d9a1a2d4ede74c63a373591453ad',1,'cv::cudev::cos(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga614c72b0e509e0de4e3ca042be6a38ff',1,'cv::cudev::cos(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44e66152581a801cbcdf6964ebbfe638',1,'cv::cudev::cos(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e0ac1b0db3ec6a7d004e1fc89dbf0af',1,'cv::cudev::cos(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4736725d299734065522400709e326eb',1,'cv::cudev::cos(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58d5b8a370d171048ac0bddc80321294',1,'cv::cudev::cos(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8a535934d73f45bfd60af81a6329b97',1,'cv::cudev::cos(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad4f55ee28b604c4177745c82127aed31',1,'cv::cudev::cos(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6ee36d3a4ea3fd487c6791b419c4e01',1,'cv::cudev::cos(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94358d7d0160d663a8789a9d760b2e42',1,'cv::cudev::cos(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ccd620456aa6135c2b91a1493a12404',1,'cv::cudev::cos(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga461b58306fbcd02c60ccee7cce7ae2f7',1,'cv::cudev::cos(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga171d264f0dd241cf3eab46d954fb6059',1,'cv::cudev::cos(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee438c36ad49662bc9c574e2110052fd',1,'cv::cudev::cos(const double4 &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga164d580371866184ddc96fa7aaf47085',1,'cos(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2591489e47c1cb227d235872e4b5e433',1,'cos(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb0891a2bcca020e132440ee65a5c607',1,'cos(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35043d3aba80393fbfb32088aaf844c',1,'cos(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dfd969175f09a6e3cdb929446c7fb33',1,'cos(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9cf8a788be723f41335cecd9153c099',1,'cos(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5c2f77b57c0110f99e599da242727e9',1,'cos(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72652522912e6ad566ab1fa77866e5f3',1,'cos(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66f81aade259c34ab035cacd0cc37bc1',1,'cos(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22d5c772cab063db3d2f9c2031b69445',1,'cos(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92d6a089d3dbe7ea3295a8c99e21d73e',1,'cos(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8be3c68d3db47d895ebf224d360f6c8',1,'cos(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fef66cbf46ebf3ef532230121b1a0b5',1,'cos(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b4d98b7371281aa2a10348ba246eb3d',1,'cos(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb0d2b5daa4ea3a0f189f9650963a32c',1,'cos(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga255d10d58f7597c1578be436742fe543',1,'cos(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga731341b35da58834dc18c6753a8da14a',1,'cos(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b03de2befefa2bdbffec33deeed31a6',1,'cos(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ad62c2d0b78462811fd8667fbd8481',1,'cos(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0c5d9a1a2d4ede74c63a373591453ad',1,'cos(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga614c72b0e509e0de4e3ca042be6a38ff',1,'cos(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44e66152581a801cbcdf6964ebbfe638',1,'cos(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e0ac1b0db3ec6a7d004e1fc89dbf0af',1,'cos(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4736725d299734065522400709e326eb',1,'cos(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58d5b8a370d171048ac0bddc80321294',1,'cos(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8a535934d73f45bfd60af81a6329b97',1,'cos(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad4f55ee28b604c4177745c82127aed31',1,'cos(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6ee36d3a4ea3fd487c6791b419c4e01',1,'cos(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94358d7d0160d663a8789a9d760b2e42',1,'cos(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ccd620456aa6135c2b91a1493a12404',1,'cos(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga461b58306fbcd02c60ccee7cce7ae2f7',1,'cos(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga171d264f0dd241cf3eab46d954fb6059',1,'cos(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee438c36ad49662bc9c574e2110052fd',1,'cos(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaed6443d175b556280b801357758d1526',1,'std::cos()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaed6443d175b556280b801357758d1526',1,'cos()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad01d50a42869218f1d54af13f71517a6',1,'Eigen::cos()']]], + ['cos_5f_1553',['cos_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1887cbcbe6962f0c1c031f58898eadd8',1,'cv::cudev::cos_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1887cbcbe6962f0c1c031f58898eadd8',1,'cos_()(Global Namespace)']]], + ['cos_5ffunc_1554',['cos_func',['https://docs.opencv.org/4.2.0/d6/dfb/structcv_1_1cudev_1_1cos__func.html',1,'cv::cudev']]], + ['cos_5ffunc_3c_20double_20_3e_1555',['cos_func< double >',['https://docs.opencv.org/4.2.0/db/d23/structcv_1_1cudev_1_1cos__func_3_01double_01_4.html',1,'cv::cudev']]], + ['cos_5ffunc_3c_20float_20_3e_1556',['cos_func< float >',['https://docs.opencv.org/4.2.0/dd/d7a/structcv_1_1cudev_1_1cos__func_3_01float_01_4.html',1,'cv::cudev']]], + ['cos_5ffunc_3c_20schar_20_3e_1557',['cos_func< schar >',['https://docs.opencv.org/4.2.0/dc/d25/structcv_1_1cudev_1_1cos__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['cos_5ffunc_3c_20short_20_3e_1558',['cos_func< short >',['https://docs.opencv.org/4.2.0/d7/d03/structcv_1_1cudev_1_1cos__func_3_01short_01_4.html',1,'cv::cudev']]], + ['cos_5ffunc_3c_20uchar_20_3e_1559',['cos_func< uchar >',['https://docs.opencv.org/4.2.0/dd/d3d/structcv_1_1cudev_1_1cos__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['cos_5ffunc_3c_20uint_20_3e_1560',['cos_func< uint >',['https://docs.opencv.org/4.2.0/da/dc1/structcv_1_1cudev_1_1cos__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['cos_5ffunc_3c_20ushort_20_3e_1561',['cos_func< ushort >',['https://docs.opencv.org/4.2.0/df/d35/structcv_1_1cudev_1_1cos__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['cosdistance_1562',['CosDistance',['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1tbm_1_1CosDistance.html',1,'cv::tbm::CosDistance'],['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1tbm_1_1CosDistance.html#aa06f335e1d6cdcd7a1d2adf6085e107a',1,'cv::tbm::CosDistance::CosDistance()']]], + ['cosh_1563',['cosh',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a627e6f11bf5854ade9a5abfc344c0367',1,'Eigen::MatrixBase::cosh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a627e6f11bf5854ade9a5abfc344c0367',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::cosh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a627e6f11bf5854ade9a5abfc344c0367',1,'MatrixBase< Solve< Decomposition, RhsType > >::cosh()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae82583ed9295e93a53c94d9753beefa2',1,'cv::cudev::cosh(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80abf13c753878730bd80b8d36e4613d',1,'cv::cudev::cosh(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1687895cecca5f84f28a584be39cd45e',1,'cv::cudev::cosh(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa21ad815bb9532046f47a05480ade46f',1,'cv::cudev::cosh(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa5385058a167c0c40d8f6b340e4a88d',1,'cv::cudev::cosh(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae42205ebe2e6a4ab6de590e3d7f3365',1,'cv::cudev::cosh(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1710177b61623035d671d74d7b1a7f6f',1,'cv::cudev::cosh(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc6eccad17e0e46d9cbd281c3e711aa9',1,'cv::cudev::cosh(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3d36b54ba6e7d9422539e8f5eabc053',1,'cv::cudev::cosh(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41a0f2e8c3df8313cd209872fbb077be',1,'cv::cudev::cosh(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1754815132974b404ef08a43fce6b3b',1,'cv::cudev::cosh(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9e0ffa2a4ba694240a28d57b3f834e0',1,'cv::cudev::cosh(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71710adfe141bc6466876c09802c3a7c',1,'cv::cudev::cosh(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a037e284c591470524139208b1025df',1,'cv::cudev::cosh(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b5476ae05fe592cb06219258730bda1',1,'cv::cudev::cosh(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa35c3ba592ccb566e04d90280066d81',1,'cv::cudev::cosh(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8feac9f8209680ba64997b6d9912b96b',1,'cv::cudev::cosh(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadca5aea02a7a85d548f637f972795df3',1,'cv::cudev::cosh(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39a476e90ccfbd91a3c1ac9683d42717',1,'cv::cudev::cosh(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19836eff7f699fb4af5ee437366bb38a',1,'cv::cudev::cosh(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc73dc8cc041afbb14d9c980c660ac89',1,'cv::cudev::cosh(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50bc228a397b21f233bfc9e785699344',1,'cv::cudev::cosh(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79a6ce397211e4078419448a1305caf2',1,'cv::cudev::cosh(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e07fc50c9ed8d4e32809ed9edb557b6',1,'cv::cudev::cosh(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf69361dca85955ba79af70994316581',1,'cv::cudev::cosh(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59924137a98c7d90f104d514af9763a0',1,'cv::cudev::cosh(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06c1f05283d886d6fe08833b58a93439',1,'cv::cudev::cosh(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga694f901aa66cf52a8c6c128d2b09a155',1,'cv::cudev::cosh(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7307bc4d07873875669d9c9586de2714',1,'cv::cudev::cosh(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec1829fdd7ff85865280fc99b9e7c35b',1,'cv::cudev::cosh(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga047c8aebd23c78678261898a69a0d68f',1,'cv::cudev::cosh(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38446fad6569393135149ae21e0155db',1,'cv::cudev::cosh(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae82583ed9295e93a53c94d9753beefa2',1,'cosh(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80abf13c753878730bd80b8d36e4613d',1,'cosh(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1687895cecca5f84f28a584be39cd45e',1,'cosh(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa21ad815bb9532046f47a05480ade46f',1,'cosh(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa5385058a167c0c40d8f6b340e4a88d',1,'cosh(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae42205ebe2e6a4ab6de590e3d7f3365',1,'cosh(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1710177b61623035d671d74d7b1a7f6f',1,'cosh(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc6eccad17e0e46d9cbd281c3e711aa9',1,'cosh(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3d36b54ba6e7d9422539e8f5eabc053',1,'cosh(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41a0f2e8c3df8313cd209872fbb077be',1,'cosh(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1754815132974b404ef08a43fce6b3b',1,'cosh(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9e0ffa2a4ba694240a28d57b3f834e0',1,'cosh(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71710adfe141bc6466876c09802c3a7c',1,'cosh(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a037e284c591470524139208b1025df',1,'cosh(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b5476ae05fe592cb06219258730bda1',1,'cosh(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa35c3ba592ccb566e04d90280066d81',1,'cosh(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8feac9f8209680ba64997b6d9912b96b',1,'cosh(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadca5aea02a7a85d548f637f972795df3',1,'cosh(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39a476e90ccfbd91a3c1ac9683d42717',1,'cosh(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19836eff7f699fb4af5ee437366bb38a',1,'cosh(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc73dc8cc041afbb14d9c980c660ac89',1,'cosh(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50bc228a397b21f233bfc9e785699344',1,'cosh(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79a6ce397211e4078419448a1305caf2',1,'cosh(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e07fc50c9ed8d4e32809ed9edb557b6',1,'cosh(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf69361dca85955ba79af70994316581',1,'cosh(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59924137a98c7d90f104d514af9763a0',1,'cosh(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06c1f05283d886d6fe08833b58a93439',1,'cosh(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga694f901aa66cf52a8c6c128d2b09a155',1,'cosh(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7307bc4d07873875669d9c9586de2714',1,'cosh(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec1829fdd7ff85865280fc99b9e7c35b',1,'cosh(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga047c8aebd23c78678261898a69a0d68f',1,'cosh(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38446fad6569393135149ae21e0155db',1,'cosh(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga8ab9fb6ce0469e0144c41f40e49a63dc',1,'std::cosh()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga8ab9fb6ce0469e0144c41f40e49a63dc',1,'cosh()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a34b99a26a2a1e7ff985a5ace16eedfcb',1,'Eigen::cosh()']]], + ['cosh_5f_1564',['cosh_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9274848df665b6483dd5063bda2eef19',1,'cv::cudev::cosh_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9274848df665b6483dd5063bda2eef19',1,'cosh_()(Global Namespace)']]], + ['cosh_5ffunc_1565',['cosh_func',['https://docs.opencv.org/4.2.0/dc/d8a/structcv_1_1cudev_1_1cosh__func.html',1,'cv::cudev']]], + ['cosh_5ffunc_3c_20double_20_3e_1566',['cosh_func< double >',['https://docs.opencv.org/4.2.0/d5/d3a/structcv_1_1cudev_1_1cosh__func_3_01double_01_4.html',1,'cv::cudev']]], + ['cosh_5ffunc_3c_20float_20_3e_1567',['cosh_func< float >',['https://docs.opencv.org/4.2.0/db/d8d/structcv_1_1cudev_1_1cosh__func_3_01float_01_4.html',1,'cv::cudev']]], + ['cosh_5ffunc_3c_20schar_20_3e_1568',['cosh_func< schar >',['https://docs.opencv.org/4.2.0/df/dd8/structcv_1_1cudev_1_1cosh__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['cosh_5ffunc_3c_20short_20_3e_1569',['cosh_func< short >',['https://docs.opencv.org/4.2.0/dc/d8a/structcv_1_1cudev_1_1cosh__func_3_01short_01_4.html',1,'cv::cudev']]], + ['cosh_5ffunc_3c_20uchar_20_3e_1570',['cosh_func< uchar >',['https://docs.opencv.org/4.2.0/de/d73/structcv_1_1cudev_1_1cosh__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['cosh_5ffunc_3c_20uint_20_3e_1571',['cosh_func< uint >',['https://docs.opencv.org/4.2.0/d5/ddd/structcv_1_1cudev_1_1cosh__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['cosh_5ffunc_3c_20ushort_20_3e_1572',['cosh_func< ushort >',['https://docs.opencv.org/4.2.0/d2/dd3/structcv_1_1cudev_1_1cosh__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['cost_5fcolor_1573',['COST_COLOR',['https://docs.opencv.org/4.2.0/d0/d03/classcv_1_1detail_1_1GraphCutSeamFinderBase.html#a42953bdb4c8a234670d37c5b5f4386cbafe0d275582723d93a0c576584ea90091',1,'cv::detail::GraphCutSeamFinderBase']]], + ['cost_5fcolor_5fgrad_1574',['COST_COLOR_GRAD',['https://docs.opencv.org/4.2.0/d0/d03/classcv_1_1detail_1_1GraphCutSeamFinderBase.html#a42953bdb4c8a234670d37c5b5f4386cba4e0af02eed7c3f02976244dc832e0e81',1,'cv::detail::GraphCutSeamFinderBase']]], + ['costfunction_1575',['CostFunction',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a6ce104a17b48a0503ccdcf4787ba2ef3',1,'cv::detail::DpSeamFinder']]], + ['costfunction_1576',['costFunction',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#adc483aee372fbff08d564e991e6dd232',1,'cv::detail::DpSeamFinder']]], + ['costgathering_1577',['costGathering',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a1c680ef014108eee62eb2269c3c480ca',1,'cv::stereo::Matching']]], + ['costtype_1578',['CostType',['https://docs.opencv.org/4.2.0/d0/d03/classcv_1_1detail_1_1GraphCutSeamFinderBase.html#a42953bdb4c8a234670d37c5b5f4386cb',1,'cv::detail::GraphCutSeamFinderBase']]], + ['count_1579',['COUNT',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57aeb9da694ea67b3ef7d524521b580867d',1,'cv::TermCriteria']]], + ['count_1580',['count',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a78e06b7798ab056aba770b6e49c549b4',1,'cv::LineIterator::count'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a38038359e14d9ca22874787801a300f0',1,'cv::tbm::ITrackerByMatching::count()'],['https://docs.opencv.org/4.2.0/da/d0b/classcv_1_1videostab_1_1VideoFileSource.html#a76fe6c31e6baa71fd8fa002345c44815',1,'cv::videostab::VideoFileSource::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ad4633f8abd7e24be8f0315dff4a0882c',1,'std::bitset::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a44da6d0dc51d80a873cc9405a805c712',1,'std::map::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a1264d32ee2fd0cfaee914fbafc088b54',1,'std::map::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a44da6d0dc51d80a873cc9405a805c712',1,'std::map::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a1264d32ee2fd0cfaee914fbafc088b54',1,'std::map::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ae7e0864011c6d6f81b75ba797edd4d9f',1,'std::multimap::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a671c765d67fd2319e73c1b5b3ceab7de',1,'std::multimap::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ae7e0864011c6d6f81b75ba797edd4d9f',1,'std::multimap::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a671c765d67fd2319e73c1b5b3ceab7de',1,'std::multimap::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a9f81b59c35ee0ef55f8a49aa63c7ed66',1,'std::multiset::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a4003ef6187ecbbdce62b861222c09802',1,'std::multiset::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a9f81b59c35ee0ef55f8a49aa63c7ed66',1,'std::multiset::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a4003ef6187ecbbdce62b861222c09802',1,'std::multiset::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a1164f8c8d8b92b1b4be8a313cede8abe',1,'std::set::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a659cf2314514a8cf2d6ecc68d08bf2ca',1,'std::set::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a1164f8c8d8b92b1b4be8a313cede8abe',1,'std::set::count(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a659cf2314514a8cf2d6ecc68d08bf2ca',1,'std::set::count(const _Kt &__x) const -> decltype(_M_t._M_count_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aa79c5f403196eb4ba5d037710830c683',1,'std::tr2::dynamic_bitset::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a4cbd19e5e859635c70822a7e1faa8e36',1,'std::unordered_map::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a323e46db071ea6d46dca69efbbc4d075',1,'std::unordered_multimap::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a758853e33d8b9dae33851ee71b42b0c8',1,'std::unordered_multiset::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a1f89dfe5f4807151e3829f060b103efc',1,'std::unordered_set::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a4cbd19e5e859635c70822a7e1faa8e36',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a229be090c665b9bf7d1fcdfd1ab6e0c1',1,'Eigen::DenseBase::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a229be090c665b9bf7d1fcdfd1ab6e0c1',1,'DenseBase< ArrayWrapper< ExpressionType > >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a229be090c665b9bf7d1fcdfd1ab6e0c1',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a229be090c665b9bf7d1fcdfd1ab6e0c1',1,'DenseBase< Solve< Decomposition, RhsType > >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'Eigen::VectorwiseOp::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const Derived, Horizontal >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const Derived, Vertical >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::count()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5c6b797457895f11a7682b3a16f263bb',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::count()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aba5ec6d1e37eda6b11eba491a1e5237e.html#aba5ec6d1e37eda6b11eba491a1e5237e',1,'nlohmann::basic_json::count()'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_aee2c188dcc802d6b28910f707a5e637b.html#aee2c188dcc802d6b28910f707a5e637b',1,'nlohmann::ordered_map::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad2f89a1340c43c8451e522d045aaa1b6',1,'std::count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad2f89a1340c43c8451e522d045aaa1b6',1,'count()(Global Namespace)']]], + ['count_5fdown_1581',['count_down',['../classutil_1_1latch.html#a3908add3019e65deb93a1a2b305a38b2',1,'util::latch']]], + ['count_5fif_1582',['count_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gab17add9e8922a4e8a9893d0d094f5e4e',1,'std::count_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gab17add9e8922a4e8a9893d0d094f5e4e',1,'count_if()(Global Namespace)']]], + ['count_5fminimal_5fn_1583',['count_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ad8cdfe2324ea2ea32021f2625b2299f1',1,'__gnu_parallel::_Settings']]], + ['countframesize_1584',['countFrameSize',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a21d0a77e972f843701cf5c846b900f1c',1,'cv::AVIWriteContainer']]], + ['countnonzero_1585',['countNonZero',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa4b89393263bb4d604e0fe5986723914',1,'cv::countNonZero()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga283f3efccb513dbcde9f1dbedb67f805',1,'cv::cuda::countNonZero(InputArray src)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga55b5d553d28530fae0d9242438396521',1,'cv::cuda::countNonZero(InputArray src, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa4b89393263bb4d604e0fe5986723914',1,'countNonZero(InputArray src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga283f3efccb513dbcde9f1dbedb67f805',1,'countNonZero(InputArray src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga55b5d553d28530fae0d9242438396521',1,'countNonZero(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], + ['countnonzero_5f_1586',['countNonZero_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga635f159cb2cc2ed5af960165ce89f3b9',1,'cv::cudev::countNonZero_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga635f159cb2cc2ed5af960165ce89f3b9',1,'countNonZero_()(Global Namespace)']]], + ['countnonzeroexprbody_1587',['CountNonZeroExprBody',['https://docs.opencv.org/4.2.0/dd/d49/structcv_1_1cudev_1_1CountNonZeroExprBody.html',1,'cv::cudev']]], + ['cout_1588',['cout',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aaf93fdf0812752e0e02c501dea1b38f0',1,'std::cout'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aaf93fdf0812752e0e02c501dea1b38f0',1,'std::cout']]], + ['cov_5fmat_5fdefault_1589',['COV_MAT_DEFAULT',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ad993005b665024ea3c067c4cccd4e898a058904bf7cacd90252c8e3499f3abfaa',1,'cv::ml::EM']]], + ['cov_5fmat_5fdiagonal_1590',['COV_MAT_DIAGONAL',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ad993005b665024ea3c067c4cccd4e898ab5fdfaa68417f5f0d2b147c6fded361d',1,'cv::ml::EM']]], + ['cov_5fmat_5fgeneric_1591',['COV_MAT_GENERIC',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ad993005b665024ea3c067c4cccd4e898a4d6181530b2faaed9bbf8ba9e9ce25d9',1,'cv::ml::EM']]], + ['cov_5fmat_5fspherical_1592',['COV_MAT_SPHERICAL',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ad993005b665024ea3c067c4cccd4e898a5e6f007058bf35fdd639811be7320f01',1,'cv::ml::EM']]], + ['covar_5fcols_1593',['COVAR_COLS',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fac8cc5a80914e18d6100184a2829aa3c0',1,'cv::COVAR_COLS'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fac8cc5a80914e18d6100184a2829aa3c0',1,'COVAR_COLS(Global Namespace)']]], + ['covar_5fnormal_1594',['COVAR_NORMAL',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fa5ff1530be25ae14f9a652788a4c26a92',1,'cv::COVAR_NORMAL'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fa5ff1530be25ae14f9a652788a4c26a92',1,'COVAR_NORMAL(Global Namespace)']]], + ['covar_5frows_1595',['COVAR_ROWS',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fadbac775ac8245aad5bfef994731c635f',1,'cv::COVAR_ROWS'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fadbac775ac8245aad5bfef994731c635f',1,'COVAR_ROWS(Global Namespace)']]], + ['covar_5fscale_1596',['COVAR_SCALE',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fac9b7943fc9402898978cbfa22717441c',1,'cv::COVAR_SCALE'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fac9b7943fc9402898978cbfa22717441c',1,'COVAR_SCALE(Global Namespace)']]], + ['covar_5fscrambled_1597',['COVAR_SCRAMBLED',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fa6fb4e6e0255e4fe67972a00d1c7936d6',1,'cv::COVAR_SCRAMBLED'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fa6fb4e6e0255e4fe67972a00d1c7936d6',1,'COVAR_SCRAMBLED(Global Namespace)']]], + ['covar_5fuse_5favg_1598',['COVAR_USE_AVG',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fa460c69e5ccfb86ea54c61222ab62dea6',1,'cv::COVAR_USE_AVG'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gga719ebd4a73f30f4fab258ab7616d0f0fa460c69e5ccfb86ea54c61222ab62dea6',1,'COVAR_USE_AVG(Global Namespace)']]], + ['covarflags_1599',['CovarFlags',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga719ebd4a73f30f4fab258ab7616d0f0f',1,'cv::CovarFlags'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga719ebd4a73f30f4fab258ab7616d0f0f',1,'CovarFlags(Global Namespace)']]], + ['covarianceestimation_1600',['covarianceEstimation',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a8db2552ff9a24347332cae1c94fef230',1,'cv::ximgproc']]], + ['cp_1601',['CP',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#ac45dca7c8856e9b2bd9f07a44a6fbbbe',1,'cv::tracking::UnscentedKalmanFilterParams']]], + ['cparams_1602',['CParams',['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html',1,'cv::face::CParams'],['https://docs.opencv.org/4.2.0/d8/dd8/structcv_1_1face_1_1CParams.html#a5da1bcff28e94d582261446703ccc03a',1,'cv::face::CParams::CParams()']]], + ['cpp_5ftype_5ftraits_2eh_1603',['cpp_type_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00311.html',1,'']]], + ['cpu_5favx_1604',['CPU_AVX',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a8faf81b6ed314cc932826ec4ea4d59a6',1,]]], + ['cpu_5favx2_1605',['CPU_AVX2',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a1fd6cf1ee58909592878a2ae274b5bce',1,]]], + ['cpu_5favx512_5fclx_1606',['CPU_AVX512_CLX',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a4d92bbd932458c2ac0e96c308615a6e1',1,]]], + ['cpu_5favx512_5fcnl_1607',['CPU_AVX512_CNL',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a7bcac929667950d65a0c2ac6fd64b986',1,]]], + ['cpu_5favx512_5fcommon_1608',['CPU_AVX512_COMMON',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a5786d569bd24b546c11418acae892a44',1,]]], + ['cpu_5favx512_5ficl_1609',['CPU_AVX512_ICL',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a9fe5c0fcdc110feeab7bf419de345eb4',1,]]], + ['cpu_5favx512_5fknl_1610',['CPU_AVX512_KNL',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a671daf4752ced762cdfe88f75a320937',1,]]], + ['cpu_5favx512_5fknm_1611',['CPU_AVX512_KNM',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a32aedb3a821d22467045dd8bfd7576f5',1,]]], + ['cpu_5favx512_5fskx_1612',['CPU_AVX512_SKX',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a5e72cc7c10e55160242460978d8dc460',1,]]], + ['cpu_5favx_5f5124fmaps_1613',['CPU_AVX_5124FMAPS',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a5ff43f81296f5c13087c01799de330a6',1,]]], + ['cpu_5favx_5f5124vnniw_1614',['CPU_AVX_5124VNNIW',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a4788b43d115eafb0314c01bacc3eb2bb',1,]]], + ['cpu_5favx_5f512bitalg_1615',['CPU_AVX_512BITALG',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ab8b16554165a17d3d890664d40fc457b',1,]]], + ['cpu_5favx_5f512bw_1616',['CPU_AVX_512BW',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ac5c16e10f1d719cc4ff4c11878c809fd',1,]]], + ['cpu_5favx_5f512cd_1617',['CPU_AVX_512CD',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a4f75062ee0470932b4dd3978c3da2345',1,]]], + ['cpu_5favx_5f512dq_1618',['CPU_AVX_512DQ',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a23c406eee21d3aa60ad7e4bfa148cfb0',1,]]], + ['cpu_5favx_5f512er_1619',['CPU_AVX_512ER',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a779eb756852e076a003a2da29ba0d05b',1,]]], + ['cpu_5favx_5f512f_1620',['CPU_AVX_512F',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802acbfa5ea4ac4b55dce9f02f916d4ba9c3',1,]]], + ['cpu_5favx_5f512ifma_1621',['CPU_AVX_512IFMA',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a25d8dd19ee03a6b199ca4afaa23fbca4',1,]]], + ['cpu_5favx_5f512ifma512_1622',['CPU_AVX_512IFMA512',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a52a18ce1a21f9b5156d130c40f6c0cd5',1,]]], + ['cpu_5favx_5f512pf_1623',['CPU_AVX_512PF',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ac3a4b309028719f9f46aa7480e3e2e93',1,]]], + ['cpu_5favx_5f512vbmi_1624',['CPU_AVX_512VBMI',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802af76a5d20542b93012367365e08f88ea6',1,]]], + ['cpu_5favx_5f512vbmi2_1625',['CPU_AVX_512VBMI2',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a014124a819d12e5a85c8b4fd285d6105',1,]]], + ['cpu_5favx_5f512vl_1626',['CPU_AVX_512VL',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a21b83178d761387f54d0986947e4b8c3',1,]]], + ['cpu_5favx_5f512vnni_1627',['CPU_AVX_512VNNI',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a0bd7fdf0fb2c21af26b006771b2599f7',1,]]], + ['cpu_5favx_5f512vpopcntdq_1628',['CPU_AVX_512VPOPCNTDQ',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ae5fd72dbef2a849e2c6470a4949c3b1d',1,]]], + ['cpu_5fdefines_2eh_1629',['cpu_defines.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00677.html',1,'']]], + ['cpu_5ffma3_1630',['CPU_FMA3',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a2b4ba6413e255bc9bb90e577013f770d',1,]]], + ['cpu_5ffp16_1631',['CPU_FP16',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ac995a654aedc70043bbe8b709f3cc5f4',1,]]], + ['cpu_5fmax_5ffeature_1632',['CPU_MAX_FEATURE',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a6b5b12670914dcac265df838e90b5813',1,]]], + ['cpu_5fmmx_1633',['CPU_MMX',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802aa7dd25359af89cd60e31edf9524294da',1,]]], + ['cpu_5fmsa_1634',['CPU_MSA',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a9eb9e92522f4304a0fb088e537fc907f',1,]]], + ['cpu_5fneon_1635',['CPU_NEON',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a8612b40158337dbe9d846a1e937670ac',1,]]], + ['cpu_5fpopcnt_1636',['CPU_POPCNT',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a285100483dfe9b0c22bb152abf4d23e6',1,]]], + ['cpu_5fsse_1637',['CPU_SSE',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a6cd6b333ce30a64366342bc42200898f',1,]]], + ['cpu_5fsse2_1638',['CPU_SSE2',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802aea8f9d1f74db87af707691acd35749b2',1,]]], + ['cpu_5fsse3_1639',['CPU_SSE3',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a2a990ca5b0f8a7df7915183b289dd6c2',1,]]], + ['cpu_5fsse4_5f1_1640',['CPU_SSE4_1',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802aacc2331d1c0c6dbb66700f70636a939f',1,]]], + ['cpu_5fsse4_5f2_1641',['CPU_SSE4_2',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a78871769cbf689bc323089879b445880',1,]]], + ['cpu_5fssse3_1642',['CPU_SSSE3',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ae0dcb0edfce2304ce1c52356c007ca9d',1,]]], + ['cpu_5fvsx_1643',['CPU_VSX',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a950cffa6194f894aef53bad183ad235d',1,]]], + ['cpu_5fvsx3_1644',['CPU_VSX3',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ac74c287e1c17e424150dc91f40ea629f',1,]]], + ['cpufeatures_1645',['CpuFeatures',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga74405b66c7a701d17cec08a50b8b2802',1,]]], + ['crbegin_1646',['crbegin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aac8666029362e1d65769694f28f28d7a',1,'__gnu_cxx::__versa_string::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< _CharT >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< _CharT, _Traits, _Allocator >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< char >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< char, char_traits< char >, _Byte_alloc >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< char_type, _Traits, _Alloc >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'basic_string< value_type >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a86674e16182ecb624e854ce7a653c03e',1,'deque< _StateSeqT >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ab0c1a4886327c94160ec35419c516f64',1,'list< __inp, __rebind_inp >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'match_results< _Bi_iter >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0403377853044ccf7f9020f98a5b0916',1,'std::basic_string::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a86674e16182ecb624e854ce7a653c03e',1,'std::deque::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ab0c1a4886327c94160ec35419c516f64',1,'std::list::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a68296cab04aadacb8da0b4bb1a8d8991',1,'std::map::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'std::match_results::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#aa3ac07de9d4cc6e2c434c3d258a8f3dc',1,'std::multimap::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a367f51af8d4d16af56b3c669808a80e9',1,'std::multiset::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aa748ce25c53c595cbb332058bf1841d3',1,'std::set::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'std::vector::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< __diff_type >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _CharClassT >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _CharT >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _Cmpt >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _Node *, _Nodeptr_Alloc >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _RealType >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _State< _TraitsT::char_type > >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< _StringT >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< block_type, allocator_type >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< Catalog_info * >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< double >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< int >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< result_type >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< size_t >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< std::pair< _BiIter, int > >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< std::pair< _StateIdT, std::vector > >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< std::pair< _StrTransT, _StrTransT > >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< sub_match< _Bi_iter >, _Alloc >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a30f4698eae082ffd64ed80c8cb648360',1,'vector< sub_match< _BiIter >, _Alloc >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'Eigen::VectorwiseOp::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const Derived, Horizontal >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const Derived, Vertical >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::crbegin()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aec95725eed4adb5ccf65fbb6e907d12e',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::crbegin()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a044298d189bdf7e4b36492de9811ddd6.html#a044298d189bdf7e4b36492de9811ddd6',1,'nlohmann::basic_json::crbegin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab429cfdfbcbf489aa4e0d1fbdd3e1c75',1,'std::crbegin()']]], + ['create_1647',['create',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a4eb2daf4732c371c7565db49f76c63ce',1,'cv::_OutputArray::create(Size sz, int type, int i=-1, bool allowTransposed=false, _OutputArray::DepthMask fixedDepthMask=static_cast< _OutputArray::DepthMask >(0)) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#abedc4c2ea80045d3d41624b2af00aafb',1,'cv::_OutputArray::create(int rows, int cols, int type, int i=-1, bool allowTransposed=false, _OutputArray::DepthMask fixedDepthMask=static_cast< _OutputArray::DepthMask >(0)) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a63bd2487f5d002496b4622f23e639ab0',1,'cv::_OutputArray::create(int dims, const int *size, int type, int i=-1, bool allowTransposed=false, _OutputArray::DepthMask fixedDepthMask=static_cast< _OutputArray::DepthMask >(0)) const'],['https://docs.opencv.org/4.2.0/d8/d2f/classcv_1_1dnn_1_1AbsLayer.html#ab8bb19eb78edb1a9c6772e209eb31672',1,'cv::dnn::AbsLayer::create()'],['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a348a6562644f9dd0f0ea60fc24439f0c',1,'cv::ximgproc::AdaptiveManifoldFilter::create()'],['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1xfeatures2d_1_1AffineFeature2D.html#a2e58c7e8e869557ad2c8554d24ea75a8',1,'cv::xfeatures2d::AffineFeature2D::create(Ptr< FeatureDetector > keypoint_detector, Ptr< DescriptorExtractor > descriptor_extractor)'],['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1xfeatures2d_1_1AffineFeature2D.html#acda5802af2e577b9785bea7caa57b5f8',1,'cv::xfeatures2d::AffineFeature2D::create(Ptr< FeatureDetector > keypoint_detector)'],['https://docs.opencv.org/4.2.0/d4/dd7/classcv_1_1AffineWarper.html#a4e4955b7ed94a2bd85bad297bec6ba03',1,'cv::AffineWarper::create()'],['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#af8c9c1af0be6d1ab7ad190aaf6c4a45c',1,'cv::AgastFeatureDetector::create()'],['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#aee9025aea852275a424e1b5934c79103',1,'cv::AKAZE::create()'],['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#a1c78150f5117029c53d6ad3cdd61af4b',1,'cv::ml::ANN_MLP::create()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1datasets_1_1AR__hmdb.html#aed9e5b48de6b8ba98ce69401a2a533ef',1,'cv::datasets::AR_hmdb::create()'],['https://docs.opencv.org/4.2.0/d5/d36/classcv_1_1datasets_1_1AR__sports.html#a746c3ac273f516826fa2cd3ec390166e',1,'cv::datasets::AR_sports::create()'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1img__hash_1_1AverageHash.html#a0f4a331d4d894aa48c681738241ddd01',1,'cv::img_hash::AverageHash::create()'],['https://docs.opencv.org/4.2.0/d4/dd2/classcv_1_1dnn_1_1BatchNormLayer.html#a0e2cfac91bfe3217e33cb6221f506bd3',1,'cv::dnn::BatchNormLayer::create()'],['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#af3baaa252f5fb027ee1b6eec1c77bbb0',1,'cv::detail::BestOf2NearestMatcher::create()'],['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#ac6418c6f87e0e12a88979ea57980c020',1,'cv::BFMatcher::create()'],['https://docs.opencv.org/4.2.0/dc/d12/classcv_1_1face_1_1BIF.html#adbc6071f0190771339f4f105a5ed624c',1,'cv::face::BIF::create()'],['https://docs.opencv.org/4.2.0/d8/d2d/classcv_1_1dnn_1_1BlankLayer.html#aeae0845e9d3739c737db8ec31f1ec9f2',1,'cv::dnn::BlankLayer::create()'],['https://docs.opencv.org/4.2.0/df/d55/classcv_1_1img__hash_1_1BlockMeanHash.html#ac18b32b0585dd07302a5667458797338',1,'cv::img_hash::BlockMeanHash::create()'],['https://docs.opencv.org/4.2.0/d0/d87/classcv_1_1dnn_1_1BNLLLayer.html#ab1f388f3ee331d92974e3175c3660404',1,'cv::dnn::BNLLLayer::create()'],['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1aruco_1_1Board.html#a06243c9dcd6fedf32992388aa7527f59',1,'cv::aruco::Board::create()'],['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#ae06452dcc8245afa4b261443d10b1d5c',1,'cv::ml::Boost::create()'],['https://docs.opencv.org/4.2.0/d1/dfd/classcv_1_1xfeatures2d_1_1BoostDesc.html#ab780ad7e9332763ce44d2b1f53381f1c',1,'cv::xfeatures2d::BoostDesc::create()'],['https://docs.opencv.org/4.2.0/d1/d93/classcv_1_1xfeatures2d_1_1BriefDescriptorExtractor.html#ae3bc52666010fb137ab6f0d32de51f60',1,'cv::xfeatures2d::BriefDescriptorExtractor::create()'],['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html#accc52b237a3a251a12fc2d749291140b',1,'cv::BRISK::create(int thresh=30, int octaves=3, float patternScale=1.0f)'],['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html#a8c202bdb80ee1077d04cf64ed9045bf2',1,'cv::BRISK::create(const std::vector< float > &radiusList, const std::vector< int > &numberList, float dMax=5.85f, float dMin=8.2f, const std::vector< int > &indexChange=std::vector< int >())'],['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html#a6720ec157fa5608d0f439732a0ec4322',1,'cv::BRISK::create(int thresh, int octaves, const std::vector< float > &radiusList, const std::vector< int > &numberList, float dMax=5.85f, float dMin=8.2f, const std::vector< int > &indexChange=std::vector< int >())'],['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html#afa8751d1156b7391318f736a535dd2fc',1,'cv::cuda::BroxOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a1b9eb33a14f929c8554b4444198a1550',1,'cv::ogl::Buffer::create(int arows, int acols, int atype, Target target=ARRAY_BUFFER, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a1ff29b1f3609d41cc350e5d407ddb9b1',1,'cv::ogl::Buffer::create(Size asize, int atype, Target target=ARRAY_BUFFER, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a44865bbb2f1c39635a63727f116fe740',1,'cv::cuda::CascadeClassifier::create(const String &filename)'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a9f1a80b86130ed1a50a46741012f9cf5',1,'cv::cuda::CascadeClassifier::create(const FileStorage &file)'],['https://docs.opencv.org/4.2.0/d7/de9/classcv_1_1dnn_1_1ChannelsPReLULayer.html#a323bc0edc5dd6acb8cea43d9cdc1b658',1,'cv::dnn::ChannelsPReLULayer::create()'],['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html#aa83b0a885d4dd137a41686991f85594c',1,'cv::aruco::CharucoBoard::create()'],['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a4c33b73248d4bb67e846510ca00b2eca',1,'cv::linemod::ColorGradient::create()'],['https://docs.opencv.org/4.2.0/df/d52/classcv_1_1img__hash_1_1ColorMomentHash.html#a09377732a355950187db4d5d38889dc2',1,'cv::img_hash::ColorMomentHash::create()'],['https://docs.opencv.org/4.2.0/de/d9a/classcv_1_1CompressedRectilinearPortraitWarper.html#ad188c78928224ebd87bdee7f214eb3ca',1,'cv::CompressedRectilinearPortraitWarper::create()'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1CompressedRectilinearWarper.html#a4a8a2e0f4f511e9f79fc7d117530652d',1,'cv::CompressedRectilinearWarper::create()'],['https://docs.opencv.org/4.2.0/da/d5c/classcv_1_1dnn_1_1ConcatLayer.html#a767fd49a5b2c8fda4705be6296e92b39',1,'cv::dnn::ConcatLayer::create()'],['https://docs.opencv.org/4.2.0/d0/d21/classcv_1_1ConjGradSolver.html#ad64e8d003cc3a6682b4fa7ab18c0c0e9',1,'cv::ConjGradSolver::create()'],['https://docs.opencv.org/4.2.0/de/dff/classcv_1_1dnn_1_1ConstLayer.html#aac2505cba10df25212d2724a0270512b',1,'cv::dnn::ConstLayer::create()'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a34a5de8c9951363ed10bc44813971d9b',1,'cv::ocl::Context::create()'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#ab2662240cf90de0069ed416557ffab93',1,'cv::ocl::Context::create(int dtype)'],['https://docs.opencv.org/4.2.0/d5/dcf/classcv_1_1dnn_1_1ConvolutionLayer.html#a1bab8014819795c973bbf192a7e3633d',1,'cv::dnn::ConvolutionLayer::create()'],['https://docs.opencv.org/4.2.0/d8/d53/classcv_1_1dnn_1_1CropAndResizeLayer.html#a8a42c6fa064f2071f58954c7723bd033',1,'cv::dnn::CropAndResizeLayer::create()'],['https://docs.opencv.org/4.2.0/d7/d86/classcv_1_1dnn_1_1CropLayer.html#a983ab75ad1f93c88e69eddec3bb8f7eb',1,'cv::dnn::CropLayer::create()'],['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#ac416a191477271c2481a1a2909172bce',1,'cv::ccalib::CustomPattern::create()'],['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a9b7ec7edbacb2cac32864513c8f73a96',1,'cv::CvFeatureEvaluator::create()'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#a2d41f24d666a64c85a6e38f73b3bec16',1,'cv::CvFeatureParams::create()'],['https://docs.opencv.org/4.2.0/d7/df6/classcv_1_1CylindricalWarper.html#a31013639d54dd58e47b9d03cc1ec3af6',1,'cv::CylindricalWarper::create()'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#a0be8f50673d543be7ce581ffb7b16742',1,'cv::xfeatures2d::DAISY::create()'],['https://docs.opencv.org/4.2.0/d5/d57/structcv_1_1hal_1_1DCT2D.html#ac24f4a880fb0dab10404dcf7c3231690',1,'cv::hal::DCT2D::create()'],['https://docs.opencv.org/4.2.0/dd/d77/classcv_1_1dnn_1_1DeconvolutionLayer.html#afb33ba7ef29c564786191767d0512bdd',1,'cv::dnn::DeconvolutionLayer::create()'],['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1cuda_1_1DensePyrLKOpticalFlow.html#a0a8d7a0a39701e77bb6b905b73269a2a',1,'cv::cuda::DensePyrLKOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html#abf0499ae92a0247cb78f28ebf66188a1',1,'cv::optflow::DenseRLOFOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a5ce7f4245a686a168335f1bc477eaf86',1,'cv::rgbd::DepthCleaner::create()'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a9a4f23de5282e49bb086ff4ea04315b2',1,'cv::linemod::DepthNormal::create()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#ab5dc5036569ecc8d47565007fa518257',1,'cv::DescriptorMatcher::create(const String &descriptorMatcherType)'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a13441ee7098af71be2a55453288360f7',1,'cv::DescriptorMatcher::create(const DescriptorMatcher::MatcherType &matcherType)'],['https://docs.opencv.org/4.2.0/da/dbd/classcv_1_1dnn_1_1DetectionOutputLayer.html#a5be4fc85b12791f9fbfb4324ebb567c7',1,'cv::dnn::DetectionOutputLayer::create()'],['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#aca7a04c0d23b3e1c575e11af697d506c',1,'cv::aruco::DetectorParameters::create()'],['https://docs.opencv.org/4.2.0/d8/d03/structcv_1_1hal_1_1DFT1D.html#aad0ee3322c93042bc23ce8b8c6935ea2',1,'cv::hal::DFT1D::create()'],['https://docs.opencv.org/4.2.0/d6/d77/structcv_1_1hal_1_1DFT2D.html#a830cbb18030e234bceb9a6a3d2931900',1,'cv::hal::DFT2D::create()'],['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a30601d33b623a8faa865d2ae68438624',1,'cv::aruco::Dictionary::create(int nMarkers, int markerSize, int randomSeed=0)'],['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a6d5e1f226078215325731aaecd3e5046',1,'cv::aruco::Dictionary::create(int nMarkers, int markerSize, const Ptr< Dictionary > &baseDictionary, int randomSeed=0)'],['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html#ac7190baea143466f303b7778d20b0ceb',1,'cv::DISOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d4/d43/classcv_1_1DownhillSolver.html#a9ef15380f5843cd4ccd9b4f3308ce0de',1,'cv::DownhillSolver::create()'],['https://docs.opencv.org/4.2.0/df/dba/classcv_1_1dpm_1_1DPMDetector.html#a712520d7ac7405227cd64f359c04e2ac',1,'cv::dpm::DPMDetector::create()'],['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#aa0ae71ed85f63d2ea809402c0f19d602',1,'cv::ml::DTrees::create()'],['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html#a6a86c0b4c94c589ebc55d28da803fa60',1,'cv::optflow::DualTVL1OpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d1/d20/classcv_1_1dynafu_1_1DynaFu.html#a0646f5d28318cdc7495246a871f98a76',1,'cv::dynafu::DynaFu::create()'],['https://docs.opencv.org/4.2.0/dd/d7c/classcv_1_1face_1_1EigenFaceRecognizer.html#a5ccb5a03dd0d8fb828f17670d9d28f68',1,'cv::face::EigenFaceRecognizer::create()'],['https://docs.opencv.org/4.2.0/d6/d6a/classcv_1_1dnn_1_1EltwiseLayer.html#a46904069ed54f077696323d5c7723b95',1,'cv::dnn::EltwiseLayer::create()'],['https://docs.opencv.org/4.2.0/df/da5/classcv_1_1dnn_1_1ELULayer.html#a16b75ffaef498f855dbe2eb05ba18366',1,'cv::dnn::ELULayer::create()'],['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a7725c8beba696cfcb6889cd5494101a4',1,'cv::ml::EM::create()'],['https://docs.opencv.org/4.2.0/d5/d7b/classcv_1_1face_1_1FacemarkAAM.html#abbb9fb9370f36723ea49b318a15f27e9',1,'cv::face::FacemarkAAM::create()'],['https://docs.opencv.org/4.2.0/dc/de0/classcv_1_1face_1_1FacemarkKazemi.html#a2a332234ec780b70e6b94cb71008650b',1,'cv::face::FacemarkKazemi::create()'],['https://docs.opencv.org/4.2.0/dc/d63/classcv_1_1face_1_1FacemarkLBF.html#a9b67c4e35ffb36f58055b5af006b4b46',1,'cv::face::FacemarkLBF::create()'],['https://docs.opencv.org/4.2.0/de/d9e/classcv_1_1FarnebackOpticalFlow.html#a4ce7a192171d340ea19e1fd670b231e7',1,'cv::FarnebackOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d9/d30/classcv_1_1cuda_1_1FarnebackOpticalFlow.html#aad66690bde57b2e926c6166cbcdae3ec',1,'cv::cuda::FarnebackOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#ab986f2ff8f8778aab1707e2642bc7f8e',1,'cv::FastFeatureDetector::create()'],['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#a1732526616df9ce7180fe6c067e05336',1,'cv::cuda::FastFeatureDetector::create()'],['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1rgbd_1_1FastICPOdometry.html#a774050fcb4b494a12e39131e016b449b',1,'cv::rgbd::FastICPOdometry::create()'],['https://docs.opencv.org/4.2.0/d2/de9/classcv_1_1face_1_1FisherFaceRecognizer.html#a0072e4c3f410250baf4b083296a41dfc',1,'cv::face::FisherFaceRecognizer::create()'],['https://docs.opencv.org/4.2.0/d5/d30/classcv_1_1FisheyeWarper.html#a99e8ac52f719086bfd3ac9c9c894cb92',1,'cv::FisheyeWarper::create()'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a7b17083dda906384465a32952c1bbe3b',1,'cv::FlannBasedMatcher::create()'],['https://docs.opencv.org/4.2.0/d4/da3/classcv_1_1dnn_1_1FlattenLayer.html#a92652ef49764bfabdbb86f79a8c7fdfb',1,'cv::dnn::FlattenLayer::create()'],['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1datasets_1_1FR__adience.html#ad107bd9a464f9743c95228e248026ec2',1,'cv::datasets::FR_adience::create()'],['https://docs.opencv.org/4.2.0/dd/dda/classcv_1_1datasets_1_1FR__lfw.html#aa263526104331585d43bb1727970a083',1,'cv::datasets::FR_lfw::create()'],['https://docs.opencv.org/4.2.0/df/db4/classcv_1_1xfeatures2d_1_1FREAK.html#a5abaecbd4071beae0284ff31462ba740',1,'cv::xfeatures2d::FREAK::create()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#a99865287feeb2dc1d75ab464e2fc1816',1,'cv::GFTTDetector::create(int maxCorners=1000, double qualityLevel=0.01, double minDistance=1, int blockSize=3, bool useHarrisDetector=false, double k=0.04)'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1GFTTDetector.html#ad72873253d5f6a5383a2bee0842c0fdd',1,'cv::GFTTDetector::create(int maxCorners, double qualityLevel, double minDistance, int blockSize, int gradiantSize, bool useHarrisDetector=false, double k=0.04)'],['https://docs.opencv.org/4.2.0/da/dfe/classcv_1_1optflow_1_1GPCForest.html#a8b6a8c989b75973f38bd8430109020d8',1,'cv::optflow::GPCForest::create()'],['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#ab459320809d8dddfc52daa043a97ef17',1,'cv::optflow::GPCTrainingSamples::create(const std::vector< String > &imagesFrom, const std::vector< String > &imagesTo, const std::vector< String > &gt, int descriptorType)'],['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#a2c8acd882c63416242c4b281d134cd1b',1,'cv::optflow::GPCTrainingSamples::create(InputArrayOfArrays imagesFrom, InputArrayOfArrays imagesTo, InputArrayOfArrays gt, int descriptorType)'],['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#aa806635cbfeb63d0d9fb2e12c6104bbf',1,'cv::optflow::GPCTree::create()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#af21454929f3efba4c783edbc27042200',1,'cv::cuda::GpuMat::create(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#af88f29d92f6fc2c29cd6ff8960954d4e',1,'cv::cuda::GpuMat::create(Size size, int type)'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a9d88407df08c49f1de5d2d062099c1fc',1,'cv::cudev::GpuMat_::create(int arows, int acols)'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a08a2c5d06291bf4ef516b3a835b2c5eb',1,'cv::cudev::GpuMat_::create(Size asize)'],['https://docs.opencv.org/4.2.0/d9/d14/classcv_1_1datasets_1_1GR__chalearn.html#ae6a896a530e25a3b1128db2ec0d75edf',1,'cv::datasets::GR_chalearn::create()'],['https://docs.opencv.org/4.2.0/d0/deb/classcv_1_1datasets_1_1GR__skig.html#a29b02a5c7a97e93502cfea349d4241cf',1,'cv::datasets::GR_skig::create()'],['https://docs.opencv.org/4.2.0/dc/d4c/classcv_1_1detail_1_1Graph.html#a36812f283b56ba6cbeec3cf3c3db3883',1,'cv::detail::Graph::create()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1structured__light_1_1GrayCodePattern.html#a1f724251afc61fc2d6f7451721cb90fe',1,'cv::structured_light::GrayCodePattern::create(const GrayCodePattern::Params &parameters=GrayCodePattern::Params())'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1structured__light_1_1GrayCodePattern.html#a5b46328443303203abae2d77902002be',1,'cv::structured_light::GrayCodePattern::create(int width, int height)'],['https://docs.opencv.org/4.2.0/de/d05/classcv_1_1aruco_1_1GridBoard.html#a8f4db0a7faad559753887e9fdd43b74c',1,'cv::aruco::GridBoard::create()'],['https://docs.opencv.org/4.2.0/d8/d94/structHaarClassifierNodeDescriptor32.html#aa7153a73228bb6ab0a744f21fd959d12',1,'HaarClassifierNodeDescriptor32::create(Ncv32f leafValue)'],['https://docs.opencv.org/4.2.0/d8/d94/structHaarClassifierNodeDescriptor32.html#a7b647bfc12d5b55c232757492181eb9c',1,'HaarClassifierNodeDescriptor32::create(Ncv32u offsetHaarClassifierNode)'],['https://docs.opencv.org/4.2.0/df/d88/structHaarFeatureDescriptor32.html#aeec844e6d66283286eef0a66cbdc49ba',1,'HaarFeatureDescriptor32::create()'],['https://docs.opencv.org/4.2.0/d1/dad/classcv_1_1xfeatures2d_1_1HarrisLaplaceFeatureDetector.html#a4d0fa401f934e253905a712668cb5ab8',1,'cv::xfeatures2d::HarrisLaplaceFeatureDetector::create()'],['https://docs.opencv.org/4.2.0/d2/de0/classcv_1_1hfs_1_1HfsSegment.html#a8078fb9b69bbe2f23556055545ed3a20',1,'cv::hfs::HfsSegment::create()'],['https://docs.opencv.org/4.2.0/d5/d7d/classcv_1_1phase__unwrapping_1_1HistogramPhaseUnwrapping.html#a36b20dc34658c5cff6790775f949187f',1,'cv::phase_unwrapping::HistogramPhaseUnwrapping::create()'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#aa652085c609b2b581bda30d76ae7539c',1,'cv::cuda::HOG::create()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a62eea66ac1a181eeeb10a2335f3bd4bd',1,'cv::cuda::HostMem::create(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a451a57a38885d605a95b4c965dd17ea7',1,'cv::cuda::HostMem::create(Size size, int type)'],['https://docs.opencv.org/4.2.0/d5/d42/classcv_1_1datasets_1_1HPE__humaneva.html#a702148fea981bf309ab4c79dda174388',1,'cv::datasets::HPE_humaneva::create()'],['https://docs.opencv.org/4.2.0/d6/d72/classcv_1_1datasets_1_1HPE__parse.html#aa4cc0a584c4b8630d8938773bd75a9bc',1,'cv::datasets::HPE_parse::create()'],['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#a3feee81430880a96fc10012468630898',1,'cv::rgbd::ICPOdometry::create()'],['https://docs.opencv.org/4.2.0/d0/dc7/classcv_1_1dnn_1_1InnerProductLayer.html#a0cb7cc22dcb0ae5d0a6468001f8e4072',1,'cv::dnn::InnerProductLayer::create()'],['https://docs.opencv.org/4.2.0/de/d56/classcv_1_1dnn_1_1InterpLayer.html#a60e9eb9326afe31febbffebd6b33e312',1,'cv::dnn::InterpLayer::create()'],['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1datasets_1_1IR__affine.html#a94df8161488e79d2bf86b043716ae8d9',1,'cv::datasets::IR_affine::create()'],['https://docs.opencv.org/4.2.0/d7/d5f/classcv_1_1datasets_1_1IR__robot.html#a3905bb399c36bad29ba5d949e9245de7',1,'cv::datasets::IR_robot::create()'],['https://docs.opencv.org/4.2.0/dd/d0e/classcv_1_1datasets_1_1IS__bsds.html#aa5d9f593cb9b4818c3bbe1510c43ed9a',1,'cv::datasets::IS_bsds::create()'],['https://docs.opencv.org/4.2.0/d9/dbe/classcv_1_1datasets_1_1IS__weizmann.html#aec27ca107ef45582526c2a6462e7184a',1,'cv::datasets::IS_weizmann::create()'],['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a9e8ebcb7cde56b3131c25cdbbb767a0b',1,'cv::KAZE::create()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#af4c66ae727523e0a1155b9837848e8a6',1,'cv::ocl::Kernel::create(const char *kname, const Program &prog)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#ad9374801e94cbfdabdd121e59d1abd73',1,'cv::ocl::Kernel::create(const char *kname, const ProgramSource &prog, const String &buildopts, String *errmsg=0)'],['https://docs.opencv.org/4.2.0/d8/d1f/classcv_1_1kinfu_1_1KinFu.html#a38c83d66127a82beaa464f05d44a2cb7',1,'cv::kinfu::KinFu::create()'],['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#ab0ce3fa7a242f3418938592f4d935b81',1,'cv::ml::KNearest::create()'],['https://docs.opencv.org/4.2.0/d6/d36/classcv_1_1xfeatures2d_1_1LATCH.html#a294058d2dd2666abf59fa384bde2bf22',1,'cv::xfeatures2d::LATCH::create()'],['https://docs.opencv.org/4.2.0/df/d25/classcv_1_1face_1_1LBPHFaceRecognizer.html#ac33ba992b16f29f2824761cea5cd5fc5',1,'cv::face::LBPHFaceRecognizer::create()'],['https://docs.opencv.org/4.2.0/d3/d6d/classcv_1_1LMSolver.html#a1f975ab807b33c5ad0c8dc07eadad87b',1,'cv::LMSolver::create(const Ptr< LMSolver::Callback > &cb, int maxIters)'],['https://docs.opencv.org/4.2.0/d3/d6d/classcv_1_1LMSolver.html#a102fa94402b7362440c49cd3213b6fe4',1,'cv::LMSolver::create(const Ptr< LMSolver::Callback > &cb, int maxIters, double eps)'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#ac123770c861631c2013aeebb677c0334',1,'cv::ml::LogisticRegression::create()'],['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#ab41522a7199f6fc4115621afe1766e8a',1,'cv::dnn::LRNLayer::create()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a853f56566ef46d7d4cd9e20e3d4a0798',1,'cv::dnn::LSTMLayer::create()'],['https://docs.opencv.org/4.2.0/d4/d86/classcv_1_1xfeatures2d_1_1LUCID.html#a293e536a14982e2b3d7da85e58c7cd7e',1,'cv::xfeatures2d::LUCID::create()'],['https://docs.opencv.org/4.2.0/d9/d5c/classcv_1_1face_1_1MACE.html#a2a088a5660f6f1ed7bd4e4881e9c4016',1,'cv::face::MACE::create()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1img__hash_1_1MarrHildrethHash.html#a0a198a58d4a95ede0eb7db951352e062',1,'cv::img_hash::MarrHildrethHash::create()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a55ced2c8d844d683ea9a725c60037ad0',1,'cv::Mat::create(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a48409946d0e1bebb40fe765e18ec5eea',1,'cv::Mat::create(Size size, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aee53524ac61fa2ba441c4f29c3aca93f',1,'cv::Mat::create(int ndims, const int *sizes, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a84f35d3923a92251631329eed66d2a12',1,'cv::Mat::create(const std::vector< int > &sizes, int type)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#aa234313065f8e7c8b333266dbb668a76',1,'cv::gapi::own::Mat::create(int _rows, int _cols, int _type)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#ae227aa0c16173d8f84f6c15a77fa73da',1,'cv::gapi::own::Mat::create(Size _size, int _type)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#ae4976c95392f50a7acb730cf192dd170',1,'cv::gapi::own::Mat::create(const std::vector< int > &_dims, int _type)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#adce382b8089699ea55fdbee77fe76ddb',1,'cv::Mat_::create(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a393ab12ff9e6647af7b70bff1eb6f91c',1,'cv::Mat_::create(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a63fa6dee6ca14f83a49d641fabcb8a69',1,'cv::Mat_::create(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#adce382b8089699ea55fdbee77fe76ddb',1,'Mat_< double >::create(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a393ab12ff9e6647af7b70bff1eb6f91c',1,'Mat_< double >::create(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a63fa6dee6ca14f83a49d641fabcb8a69',1,'Mat_< double >::create(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#adce382b8089699ea55fdbee77fe76ddb',1,'Mat_< float >::create(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a393ab12ff9e6647af7b70bff1eb6f91c',1,'Mat_< float >::create(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a63fa6dee6ca14f83a49d641fabcb8a69',1,'Mat_< float >::create(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#adce382b8089699ea55fdbee77fe76ddb',1,'Mat_< uchar >::create(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a393ab12ff9e6647af7b70bff1eb6f91c',1,'Mat_< uchar >::create(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a63fa6dee6ca14f83a49d641fabcb8a69',1,'Mat_< uchar >::create(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#adce382b8089699ea55fdbee77fe76ddb',1,'Mat_< unsigned char >::create(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a393ab12ff9e6647af7b70bff1eb6f91c',1,'Mat_< unsigned char >::create(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a63fa6dee6ca14f83a49d641fabcb8a69',1,'Mat_< unsigned char >::create(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html#abcb79e3d0bf5e2e1b670196035d69777',1,'cv::dnn::MaxUnpoolLayer::create()'],['https://docs.opencv.org/4.2.0/de/d04/classcv_1_1MercatorWarper.html#ac3107ac6dfdbba0724475c6819c64fd2',1,'cv::MercatorWarper::create()'],['https://docs.opencv.org/4.2.0/d4/da1/classcv_1_1dnn_1_1MishLayer.html#a435c8f70e356be5790a77ae9bdcb7a12',1,'cv::dnn::MishLayer::create()'],['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html#aa6e6d3c9b5a672e4019c215d50f0e0d2',1,'cv::linemod::Modality::create(const String &modality_type)'],['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html#af89910d21ad063495b76526fc451ac54',1,'cv::linemod::Modality::create(const FileNode &fn)'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a11bb217263bb00d7330777286e481e04',1,'cv::saliency::MotionSaliencyBinWangApr2014::create()'],['https://docs.opencv.org/4.2.0/d0/dcf/classcv_1_1xfeatures2d_1_1MSDDetector.html#a8a3346e89e45bab5f53f67a525431b9d',1,'cv::xfeatures2d::MSDDetector::create()'],['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#a136c6b29fbcdd783a1003bf429fa17ed',1,'cv::MSER::create()'],['https://docs.opencv.org/4.2.0/dc/de4/classcv_1_1datasets_1_1MSM__epfl.html#ab63f6a7099dffccf4727681977f84eaa',1,'cv::datasets::MSM_epfl::create()'],['https://docs.opencv.org/4.2.0/d2/dcc/classcv_1_1datasets_1_1MSM__middlebury.html#adcc1a53b9655d1ad5225923256d95246',1,'cv::datasets::MSM_middlebury::create()'],['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html#a64436fb8ab6b1a88b33a12d0f3c81c5c',1,'cv::MultiTracker::create()'],['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html#a37f8e98fc8ee17db7e2f1fe86c2ed3bb',1,'cv::dnn::MVNLayer::create()'],['https://docs.opencv.org/4.2.0/d4/d8e/classcv_1_1ml_1_1NormalBayesClassifier.html#a785df31a648deca899a5d6ee56bcdab0',1,'cv::ml::NormalBayesClassifier::create()'],['https://docs.opencv.org/4.2.0/dc/df8/classcv_1_1dnn_1_1NormalizeBBoxLayer.html#a85a126cc438a2b901aa4784ba2494c42',1,'cv::dnn::NormalizeBBoxLayer::create()'],['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a83b080591b5f2b744352261ce4709d7e',1,'cv::cuda::NvidiaOpticalFlow_1_0::create()'],['https://docs.opencv.org/4.2.0/db/d63/classcv_1_1saliency_1_1ObjectnessBING.html#afa994cae12d287aaa5a2c9eafab52cba',1,'cv::saliency::ObjectnessBING::create()'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a394a90c411fd7b8717b3295b95102cb4',1,'cv::text::OCRBeamSearchDecoder::create(const Ptr< OCRBeamSearchDecoder::ClassifierCallback > classifier, const std::string &vocabulary, InputArray transition_probabilities_table, InputArray emission_probabilities_table, decoder_mode mode=OCR_DECODER_VITERBI, int beam_size=500)'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#ac6a5b37be75f3c891c0dcc194e86972e',1,'cv::text::OCRBeamSearchDecoder::create(const Ptr< OCRBeamSearchDecoder::ClassifierCallback > classifier, const String &vocabulary, InputArray transition_probabilities_table, InputArray emission_probabilities_table, int mode=OCR_DECODER_VITERBI, int beam_size=500)'],['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a01b6739f657ddf0c53135f1c370cbb7d',1,'cv::text::OCRBeamSearchDecoder::create(const String &filename, const String &vocabulary, InputArray transition_probabilities_table, InputArray emission_probabilities_table, int mode=OCR_DECODER_VITERBI, int beam_size=500)'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a5ba05f246ceb4197294b86c1acc1f2e4',1,'cv::text::OCRHMMDecoder::create(const Ptr< OCRHMMDecoder::ClassifierCallback > classifier, const String &vocabulary, InputArray transition_probabilities_table, InputArray emission_probabilities_table, int mode=OCR_DECODER_VITERBI)'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a785259e52d2041f46f8f0ee510f1f974',1,'cv::text::OCRHMMDecoder::create(const String &filename, const String &vocabulary, InputArray transition_probabilities_table, InputArray emission_probabilities_table, int mode=OCR_DECODER_VITERBI, int classifier=OCR_KNN_CLASSIFIER)'],['https://docs.opencv.org/4.2.0/d0/d8f/classcv_1_1text_1_1OCRHolisticWordRecognizer.html#a37f077897f3f03a7f4094be5f4b5eb41',1,'cv::text::OCRHolisticWordRecognizer::create()'],['https://docs.opencv.org/4.2.0/d7/ddc/classcv_1_1text_1_1OCRTesseract.html#a391b1e753f0b779b72204ec15200a99a',1,'cv::text::OCRTesseract::create()'],['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a7763a1c1ffaff84eb3de6b6c83d157af',1,'cv::rgbd::Odometry::create()'],['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#aa77e3cf9fbea8b6dec0a5f450db5efa9',1,'cv::rgbd::OdometryFrame::create()'],['https://docs.opencv.org/4.2.0/d6/d39/classcv_1_1cuda_1_1OpticalFlowDual__TVL1.html#af630800c27534d7d0df7c7a335207c64',1,'cv::cuda::OpticalFlowDual_TVL1::create()'],['https://docs.opencv.org/4.2.0/db/df7/classcv_1_1datasets_1_1OR__imagenet.html#a9a53a25b8cc24d7b6c8bc4394ba93ce6',1,'cv::datasets::OR_imagenet::create()'],['https://docs.opencv.org/4.2.0/d9/d92/classcv_1_1datasets_1_1OR__mnist.html#a286c06a100a62607a853b9ade1104144',1,'cv::datasets::OR_mnist::create()'],['https://docs.opencv.org/4.2.0/d4/d7e/classcv_1_1datasets_1_1OR__pascal.html#a3516c64e875b6d46c56689012fdb03ae',1,'cv::datasets::OR_pascal::create()'],['https://docs.opencv.org/4.2.0/da/d69/classcv_1_1datasets_1_1OR__sun.html#a4dca609bd43c4a5dcd8302d0c1f4c091',1,'cv::datasets::OR_sun::create()'],['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#aeff0cbe668659b7ca14bb85ff1c4073b',1,'cv::ORB::create()'],['https://docs.opencv.org/4.2.0/da/d44/classcv_1_1cuda_1_1ORB.html#a305d0dab874e77a9c991fbc007a7aa22',1,'cv::cuda::ORB::create()'],['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1dnn_1_1PaddingLayer.html#abdb8e6e3739fea23b742293c7741f342',1,'cv::dnn::PaddingLayer::create()'],['https://docs.opencv.org/4.2.0/d0/d8b/classcv_1_1PaniniPortraitWarper.html#aca41525cfdac6d3031869ddb379ed234',1,'cv::PaniniPortraitWarper::create()'],['https://docs.opencv.org/4.2.0/dd/db0/classcv_1_1PaniniWarper.html#a702fdddd7659428c357e243475536c45',1,'cv::PaniniWarper::create()'],['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a0f7cb2424b2a1f5c45670b20c83acc96',1,'cv::ml::ParamGrid::create()'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a9e2ff603a2706f9a64aa00aa7acd6b5a',1,'cv::xfeatures2d::PCTSignatures::create(const int initSampleCount=2000, const int initSeedCount=400, const int pointDistribution=0)'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a562a030ed45731adba1a1954270c6825',1,'cv::xfeatures2d::PCTSignatures::create(const std::vector< Point2f > &initSamplingPoints, const int initSeedCount)'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a77aa42e4c641f25c33aa9355f8b11352',1,'cv::xfeatures2d::PCTSignatures::create(const std::vector< Point2f > &initSamplingPoints, const std::vector< int > &initClusterSeedIndexes)'],['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1xfeatures2d_1_1PCTSignaturesSQFD.html#a29ddb040ed05692854dd7be8acd2c7bd',1,'cv::xfeatures2d::PCTSignaturesSQFD::create()'],['https://docs.opencv.org/4.2.0/da/d8d/classcv_1_1datasets_1_1PD__caltech.html#a248c578856c0ad7bfb2d5da6d38fcc69',1,'cv::datasets::PD_caltech::create()'],['https://docs.opencv.org/4.2.0/d2/d61/classcv_1_1datasets_1_1PD__inria.html#a70ae2dbe64a9d08d3c97f14ea607d984',1,'cv::datasets::PD_inria::create()'],['https://docs.opencv.org/4.2.0/d2/d3c/classcv_1_1dnn_1_1PermuteLayer.html#a9a7cc466f5feadb96ef33c839e50e960',1,'cv::dnn::PermuteLayer::create()'],['https://docs.opencv.org/4.2.0/df/d4e/classcv_1_1img__hash_1_1PHash.html#a5dc7f32d7c0777b2d2c046b66d26ba8a',1,'cv::img_hash::PHash::create()'],['https://docs.opencv.org/4.2.0/d0/d57/classcv_1_1PlaneWarper.html#a77bb27e6bc4cf8d6e86c66e2885b86f0',1,'cv::PlaneWarper::create()'],['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a93bcea87b6c2e6dfcd64c909ac62b48a',1,'cv::plot::Plot2d::create(InputArray data)'],['https://docs.opencv.org/4.2.0/d0/d1e/classcv_1_1plot_1_1Plot2d.html#a52199a521d4e83c402acecd577f6c0ab',1,'cv::plot::Plot2d::create(InputArray dataX, InputArray dataY)'],['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#add7f134057686c59f09735d1290a2483',1,'cv::dnn::PoolingLayer::create()'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1dnn_1_1PowerLayer.html#acda0d129ec298d5918acb13616d246a6',1,'cv::dnn::PowerLayer::create()'],['https://docs.opencv.org/4.2.0/da/d1e/classcv_1_1dnn_1_1PriorBoxLayer.html#aec3c9b650bc5eb337b91e3343c1e06b4',1,'cv::dnn::PriorBoxLayer::create()'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#aefabbfce0ead62656025b1765422d612',1,'cv::ocl::Program::create()'],['https://docs.opencv.org/4.2.0/da/d6b/classcv_1_1dnn_1_1ProposalLayer.html#ad3caa47b7735e1a62bc800f0fa79b0e8',1,'cv::dnn::ProposalLayer::create()'],['https://docs.opencv.org/4.2.0/d8/d99/classcv_1_1quality_1_1QualityBRISQUE.html#a5bb32aad7250b41a13c219f257654ef5',1,'cv::quality::QualityBRISQUE::create(const cv::String &model_file_path, const cv::String &range_file_path)'],['https://docs.opencv.org/4.2.0/d8/d99/classcv_1_1quality_1_1QualityBRISQUE.html#ad13a4961246174bf46affa1c55155e6e',1,'cv::quality::QualityBRISQUE::create(const cv::Ptr< cv::ml::SVM > &model, const cv::Mat &range)'],['https://docs.opencv.org/4.2.0/d8/d81/classcv_1_1quality_1_1QualityGMSD.html#ac7681a5eeb9cf9ade707acafcb728b52',1,'cv::quality::QualityGMSD::create()'],['https://docs.opencv.org/4.2.0/d7/d80/classcv_1_1quality_1_1QualityMSE.html#a369b3cea228b51e5114859998f453019',1,'cv::quality::QualityMSE::create()'],['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#a7f1172097d71d88a43df6e1a3d1dd09a',1,'cv::quality::QualityPSNR::create()'],['https://docs.opencv.org/4.2.0/d9/db5/classcv_1_1quality_1_1QualitySSIM.html#a6923ba31a5e69f61f4937843d9549adf',1,'cv::quality::QualitySSIM::create()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga67a1543e567dbfaa0b05630951caac2b',1,'cv::stereo::QuasiDenseStereo::create()'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a0f1172e0870daae02565f852e493a578',1,'cv::ocl::Queue::create()'],['https://docs.opencv.org/4.2.0/d5/d97/classcv_1_1img__hash_1_1RadialVarianceHash.html#afe5442f5e86d02ca44f14a8026c021fb',1,'cv::img_hash::RadialVarianceHash::create()'],['https://docs.opencv.org/4.2.0/d1/d21/classcv_1_1dnn_1_1RegionLayer.html#a8607d79b8dd79d6573c221c33f362290',1,'cv::dnn::RegionLayer::create()'],['https://docs.opencv.org/4.2.0/dc/dcd/classcv_1_1dnn_1_1ReLU6Layer.html#aede70730a8dfbb2ff0b0741ffc9f807c',1,'cv::dnn::ReLU6Layer::create()'],['https://docs.opencv.org/4.2.0/dd/df0/classcv_1_1dnn_1_1ReLULayer.html#a637030d31dce95e9f3ca33b39b5752d4',1,'cv::dnn::ReLULayer::create()'],['https://docs.opencv.org/4.2.0/d6/da3/classcv_1_1dnn_1_1ReorgLayer.html#a0b0fba10e5526149f952f468e2b2caab',1,'cv::dnn::ReorgLayer::create()'],['https://docs.opencv.org/4.2.0/db/d15/classcv_1_1dnn_1_1ReshapeLayer.html#aab80c00f9c0ed695858592775f49dc0b',1,'cv::dnn::ReshapeLayer::create()'],['https://docs.opencv.org/4.2.0/db/d38/classcv_1_1dnn_1_1ResizeLayer.html#ab6ace17a47e625459017cdba7092452f',1,'cv::dnn::ResizeLayer::create()'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a5089c21c98da9e7ccf0a6896e7d6a400',1,'cv::bioinspired::Retina::create(Size inputSize)'],['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1bioinspired_1_1Retina.html#a689eb94c4d177294f3fcc21612a60312',1,'cv::bioinspired::Retina::create(Size inputSize, const bool colorMode, int colorSamplingMethod=RETINA_COLOR_BAYER, const bool useRetinaLogSampling=false, const float reductionFactor=1.0f, const float samplingStrenght=10.0f)'],['https://docs.opencv.org/4.2.0/dd/d73/classcv_1_1bioinspired_1_1RetinaFastToneMapping.html#abfb3992c9c153320986fc21e2c005d62',1,'cv::bioinspired::RetinaFastToneMapping::create()'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#ac1756dbf37adeaa6aa8f1c42495aa99d',1,'cv::rgbd::RgbdFrame::create()'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a05db54983c3635cd0a9219c0daa556b5',1,'cv::rgbd::RgbdICPOdometry::create()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a601c3cf90497731fe74995a2a977b026',1,'cv::rgbd::RgbdNormals::create()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1rgbd_1_1RgbdOdometry.html#a218fb178f66322e765281ceed04d6261',1,'cv::rgbd::RgbdOdometry::create()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a5527911bc5018b8a6aefa8d6bc1c13fe',1,'cv::rgbd::RgbdPlane::create()'],['https://docs.opencv.org/4.2.0/d4/d36/classcv_1_1ximgproc_1_1RidgeDetectionFilter.html#a64b8608420e891b338d72d09b3b5df49',1,'cv::ximgproc::RidgeDetectionFilter::create()'],['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#ab924694c071f1b173277c3c70453b087',1,'cv::optflow::RLOFOpticalFlowParameter::create()'],['https://docs.opencv.org/4.2.0/dd/dfd/classcv_1_1dnn_1_1RNNLayer.html#abc9954a46911f411abc280adf5fb3c52',1,'cv::dnn::RNNLayer::create()'],['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html#a39dae109b823a296bb7077d99970e664',1,'cv::ml::RTrees::create()'],['https://docs.opencv.org/4.2.0/dd/dde/classcv_1_1dnn_1_1ScaleLayer.html#a7adc86c3e8c4b46a5e8aae53244e7384',1,'cv::dnn::ScaleLayer::create()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1sfm_1_1SFMLibmvEuclideanReconstruction.html#a329dd5053cbde7352ab071ad2ccc295e',1,'cv::sfm::SFMLibmvEuclideanReconstruction::create()'],['https://docs.opencv.org/4.2.0/d3/dd8/classcv_1_1dnn_1_1ShiftLayer.html#a2911784b21f90f0233650a41030e4619',1,'cv::dnn::ShiftLayer::create()'],['https://docs.opencv.org/4.2.0/de/d24/classcv_1_1dnn_1_1ShuffleChannelLayer.html#a3d2eb60bba760dbaca899dd6a9f695c5',1,'cv::dnn::ShuffleChannelLayer::create()'],['https://docs.opencv.org/4.2.0/d5/d3c/classcv_1_1xfeatures2d_1_1SIFT.html#a865f4dee68820970872c46241437f9cd',1,'cv::xfeatures2d::SIFT::create()'],['https://docs.opencv.org/4.2.0/dc/d09/classcv_1_1dnn_1_1SigmoidLayer.html#ae1cd5bb216f10da21110269155a9fcc9',1,'cv::dnn::SigmoidLayer::create()'],['https://docs.opencv.org/4.2.0/d0/d7a/classcv_1_1SimpleBlobDetector.html#a1d7a06c8b8749207a978e42cd8d0cdf6',1,'cv::SimpleBlobDetector::create()'],['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1structured__light_1_1SinusoidalPattern.html#a97045af313f2fa0fa68b12734cf48320',1,'cv::structured_light::SinusoidalPattern::create()'],['https://docs.opencv.org/4.2.0/d6/d92/classcv_1_1datasets_1_1SLAM__kitti.html#a058d6b419bc578a20bd45f35ddc4534c',1,'cv::datasets::SLAM_kitti::create()'],['https://docs.opencv.org/4.2.0/da/d91/classcv_1_1datasets_1_1SLAM__tumindoor.html#aa129a4bcd6c8d06c680d4db54a5762d3',1,'cv::datasets::SLAM_tumindoor::create()'],['https://docs.opencv.org/4.2.0/de/d61/classcv_1_1dnn_1_1SliceLayer.html#ab71bf5df3d57ff38a5e12badd6d5a087',1,'cv::dnn::SliceLayer::create()'],['https://docs.opencv.org/4.2.0/d8/d18/classcv_1_1dnn_1_1SoftmaxLayer.html#acc92a20152fc28368feb8095757727a0',1,'cv::dnn::SoftmaxLayer::create()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#adf2713a5ec1fb025c9ff4014a53e68c6',1,'cv::SparseMat::create()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a18a20736ff3a669e99e041d1c4fa7110',1,'cv::SparseMat_::create()'],['https://docs.opencv.org/4.2.0/d7/d05/classcv_1_1cuda_1_1SparsePyrLKOpticalFlow.html#a96b4a66c28a3d345768a777e03dc0eab',1,'cv::cuda::SparsePyrLKOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d7/d08/classcv_1_1SparsePyrLKOpticalFlow.html#ab1b8b97d4f9b814eb64030c64b8292a4',1,'cv::SparsePyrLKOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/df/dc4/classcv_1_1optflow_1_1SparseRLOFOpticalFlow.html#aba5f11e32835a1bb9cf581294607e728',1,'cv::optflow::SparseRLOFOpticalFlow::create()'],['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1SphericalWarper.html#aff695ac7d04e494059ef97fecb918c37',1,'cv::SphericalWarper::create()'],['https://docs.opencv.org/4.2.0/dd/df9/classcv_1_1dnn_1_1SplitLayer.html#ab33cd669fb9a32233224be90edb552f6',1,'cv::dnn::SplitLayer::create()'],['https://docs.opencv.org/4.2.0/d6/d05/classcv_1_1datasets_1_1SR__bsds.html#a38c4798527052998a296b62feba2f848',1,'cv::datasets::SR_bsds::create()'],['https://docs.opencv.org/4.2.0/d2/db5/classcv_1_1datasets_1_1SR__div2k.html#ae4df44b1939b6c38cfd48a626977e300',1,'cv::datasets::SR_div2k::create()'],['https://docs.opencv.org/4.2.0/d5/d19/classcv_1_1datasets_1_1SR__general100.html#ac61d7a592c19e37f729ca45a4bcc4736',1,'cv::datasets::SR_general100::create()'],['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#a32c729774cf7fe39d44e82ef104a39cc',1,'cv::face::StandardCollector::create()'],['https://docs.opencv.org/4.2.0/dd/d39/classcv_1_1xfeatures2d_1_1StarDetector.html#a9f1ed97bd2b42e30fc0fb1355ad262d3',1,'cv::xfeatures2d::StarDetector::create()'],['https://docs.opencv.org/4.2.0/da/dd0/classcv_1_1saliency_1_1StaticSaliencyFineGrained.html#a2ed3862baf0b92e15c3717907add7be9',1,'cv::saliency::StaticSaliencyFineGrained::create()'],['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#ab4e9a99c23f99d49ff02f8764b48ebf0',1,'cv::saliency::StaticSaliencySpectralResidual::create()'],['https://docs.opencv.org/4.2.0/d7/d8e/classcv_1_1stereo_1_1StereoBinaryBM.html#a1f0793fc10a980610acbd536d3afcf38',1,'cv::stereo::StereoBinaryBM::create()'],['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a756d8cdcc116945e6eea8b3a6103b92e',1,'cv::stereo::StereoBinarySGBM::create()'],['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1StereoBM.html#a04fdf00525f82fe708d556e2cd359004',1,'cv::StereoBM::create()'],['https://docs.opencv.org/4.2.0/d2/d5e/classcv_1_1StereographicWarper.html#a1a772255d9246906fa1698a4b760b915',1,'cv::StereographicWarper::create()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#adb7a50ef5f200ad9559e9b0e976cfa59',1,'cv::StereoSGBM::create()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a308a47865a1f381e4429c8ec5e99549f',1,'cv::Stitcher::create()'],['https://docs.opencv.org/4.2.0/d5/df7/classcv_1_1xfeatures2d_1_1SURF.html#a436553ca44d9a2238761ddbee5b395e5',1,'cv::xfeatures2d::SURF::create()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a2fe8b5bf897c34b8e911397b42e2cb44',1,'cv::ml::SVM::create()'],['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a8dcb30f2aa335cf943fe52c2b8b7e954',1,'cv::ml::SVMSGD::create()'],['https://docs.opencv.org/4.2.0/d9/d63/classcv_1_1dnn_1_1SwishLayer.html#a7e7ff59243eadefe609e80a2d03ec92e',1,'cv::dnn::SwishLayer::create()'],['https://docs.opencv.org/4.2.0/df/d66/classcv_1_1dnn_1_1TanHLayer.html#a611dce31ac5365cae57edcad47ebdd66',1,'cv::dnn::TanHLayer::create()'],['https://docs.opencv.org/4.2.0/d1/d66/classcv_1_1text_1_1TextDetectorCNN.html#aeeca0f5caf9bec0f3f6ae2702057fa9a',1,'cv::text::TextDetectorCNN::create(const String &modelArchFilename, const String &modelWeightsFilename, std::vector< Size > detectionSizes)'],['https://docs.opencv.org/4.2.0/d1/d66/classcv_1_1text_1_1TextDetectorCNN.html#a24c574de8cd02e4eb14f402c08dc4c2f',1,'cv::text::TextDetectorCNN::create(const String &modelArchFilename, const String &modelWeightsFilename)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a44434d109746820cd8b3b14364dedd31',1,'cv::ogl::Texture2D::create(int arows, int acols, Format aformat, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#af9270d0d351251d3006a6e6a8dd01964',1,'cv::ogl::Texture2D::create(Size asize, Format aformat, bool autoRelease=false)'],['https://docs.opencv.org/4.2.0/d7/dc3/classcv_1_1datasets_1_1TR__chars.html#a6bf21b5a6809d19d36a18a6ae74477a2',1,'cv::datasets::TR_chars::create()'],['https://docs.opencv.org/4.2.0/d7/dfb/classcv_1_1datasets_1_1TR__icdar.html#ab012a43900d6cc21be28f98d4ea9592a',1,'cv::datasets::TR_icdar::create()'],['https://docs.opencv.org/4.2.0/da/dc9/classcv_1_1datasets_1_1TR__svt.html#a210aad66282bff94c30fca6055dddf71',1,'cv::datasets::TR_svt::create()'],['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a2ad74f2af3c2065665dea125ece6ae53',1,'cv::datasets::TRACK_alov::create()'],['https://docs.opencv.org/4.2.0/dc/d52/classcv_1_1datasets_1_1TRACK__vot.html#a08040989ee22f78d12e748daecc58f7d',1,'cv::datasets::TRACK_vot::create()'],['https://docs.opencv.org/4.2.0/d1/d1a/classcv_1_1TrackerBoosting.html#aac2e7cae09f8aa7033723fb9f6910a8c',1,'cv::TrackerBoosting::create(const TrackerBoosting::Params &parameters)'],['https://docs.opencv.org/4.2.0/d1/d1a/classcv_1_1TrackerBoosting.html#ab23a9982c86f4a6b287c57e90d71cbaf',1,'cv::TrackerBoosting::create()'],['https://docs.opencv.org/4.2.0/d2/da2/classcv_1_1TrackerCSRT.html#a46b22b240d0dc3567bd8f0818f8e5bf9',1,'cv::TrackerCSRT::create(const TrackerCSRT::Params &parameters)'],['https://docs.opencv.org/4.2.0/d2/da2/classcv_1_1TrackerCSRT.html#a8165e42a785fcd88226ca80eea8dc8fb',1,'cv::TrackerCSRT::create()'],['https://docs.opencv.org/4.2.0/d7/da2/classcv_1_1TrackerFeature.html#aee351984f2ff5112a40cdaaa3b047079',1,'cv::TrackerFeature::create()'],['https://docs.opencv.org/4.2.0/d7/d4c/classcv_1_1TrackerGOTURN.html#a45f204a1fb7a92d72f7971a61a5ba656',1,'cv::TrackerGOTURN::create(const TrackerGOTURN::Params &parameters)'],['https://docs.opencv.org/4.2.0/d7/d4c/classcv_1_1TrackerGOTURN.html#aa2136acda39bc3e56c87857bb29b4ac3',1,'cv::TrackerGOTURN::create()'],['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#a8233d531a13a605e1b0d119a9058d8c7',1,'cv::TrackerKCF::create(const TrackerKCF::Params &parameters)'],['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#aa639858d75cfbfe59ae7afdd57070aef',1,'cv::TrackerKCF::create()'],['https://docs.opencv.org/4.2.0/d7/d86/classcv_1_1TrackerMedianFlow.html#a15b0a2920910ef6f0dda3a7e882fb2e8',1,'cv::TrackerMedianFlow::create(const TrackerMedianFlow::Params &parameters)'],['https://docs.opencv.org/4.2.0/d7/d86/classcv_1_1TrackerMedianFlow.html#a648b6755535c289aa606de4d8a581edf',1,'cv::TrackerMedianFlow::create()'],['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1TrackerMIL.html#a9699975916249a7edf69dc484c06a131',1,'cv::TrackerMIL::create(const TrackerMIL::Params &parameters)'],['https://docs.opencv.org/4.2.0/d0/d26/classcv_1_1TrackerMIL.html#aadd1a6748f4417131b53bf0832c290d3',1,'cv::TrackerMIL::create()'],['https://docs.opencv.org/4.2.0/d0/d02/classcv_1_1TrackerMOSSE.html#a31cb6f4535fee7acac5ddf014f96ac8d',1,'cv::TrackerMOSSE::create()'],['https://docs.opencv.org/4.2.0/dc/d75/classcv_1_1TrackerSamplerAlgorithm.html#a178e1fddbefbeb1232c131f4c1e715fe',1,'cv::TrackerSamplerAlgorithm::create()'],['https://docs.opencv.org/4.2.0/d2/db9/classcv_1_1TrackerStateEstimator.html#a4df632281f100fe1c4516ff196c08cfd',1,'cv::TrackerStateEstimator::create()'],['https://docs.opencv.org/4.2.0/dc/d1c/classcv_1_1TrackerTLD.html#a09727d29b7e2b3ad6ed533a7c32b304a',1,'cv::TrackerTLD::create(const TrackerTLD::Params &parameters)'],['https://docs.opencv.org/4.2.0/dc/d1c/classcv_1_1TrackerTLD.html#ae0ef488f924b8e44562ec14d87920d70',1,'cv::TrackerTLD::create()'],['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#a5e0c052f9aadce1f75cddbdbbf9c4f4d',1,'cv::ml::TrainData::create()'],['https://docs.opencv.org/4.2.0/da/d6e/classcv_1_1bioinspired_1_1TransientAreasSegmentationModule.html#a863589f7fea7d1d5a9c9bfaae7480105',1,'cv::bioinspired::TransientAreasSegmentationModule::create()'],['https://docs.opencv.org/4.2.0/df/d33/classcv_1_1TransverseMercatorWarper.html#ab526ce2f23ea97145197487b266737a1',1,'cv::TransverseMercatorWarper::create()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#afe3063b40dd6c5d8a0054759c1142631',1,'cv::UMat::create(int rows, int cols, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ac0b2ce3cbd609f68092b8cffa2cc7155',1,'cv::UMat::create(Size size, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a0d6066cb804ad356c18fd7dc89203b92',1,'cv::UMat::create(int ndims, const int *sizes, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a1f51b337fe0ee25e7c659502e3fe1022',1,'cv::UMat::create(const std::vector< int > &sizes, int type, UMatUsageFlags usageFlags=USAGE_DEFAULT)'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1VariationalRefinement.html#a2b76ef34213b0f7279d64a5cfc5e0b11',1,'cv::VariationalRefinement::create()'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html#a34d18f82108b0fc399c8cd3bf2055237',1,'cv::xfeatures2d::VGG::create()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a24352ee160cb574af9c0a2ee4738b184',1,'cv::VideoWriter::create()'],['https://docs.opencv.org/4.2.0/d7/d1c/classcv_1_1WarperCreator.html#af89203acc50687d52d10257cbc8b3e09',1,'cv::WarperCreator::create()'],['https://docs.opencv.org/4.2.0/de/d0e/classcv_1_1xobjdetect_1_1WBDetector.html#a4d5db0d0bc5e276a4a53d8d34fabd14a',1,'cv::xobjdetect::WBDetector::create()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga67a1543e567dbfaa0b05630951caac2b',1,'create(cv::Size monoImgSize, cv::String paramFilepath=cv::String())(Global Namespace)']]], + ['create_20calibration_20pattern_1648',['Create calibration pattern',['https://docs.opencv.org/4.2.0/da/d0d/tutorial_camera_calibration_pattern.html',1,'']]], + ['create_5fhard_5flinks_1649',['create_hard_links',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a33508470ccdd33a1e663771efff2934b',1,'create_hard_links(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a33508470ccdd33a1e663771efff2934b',1,'create_hard_links(Global Namespace)']]], + ['create_5fread_5fwrite_5fdataset_2emarkdown_1650',['create_read_write_dataset.markdown',['https://docs.opencv.org/4.2.0/db/d27/create__read__write__dataset_8markdown.html',1,'']]], + ['create_5fsymlinks_1651',['create_symlinks',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a0e556d0167c1732aede37f4b39b59bce',1,'create_symlinks(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a0e556d0167c1732aede37f4b39b59bce',1,'create_symlinks(Global Namespace)']]], + ['createaffinetransformer_1652',['createAffineTransformer',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gaf2fba7d213cfd8a9e163171dcbbb12e3',1,'cv::createAffineTransformer()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gaf2fba7d213cfd8a9e163171dcbbb12e3',1,'createAffineTransformer()(Global Namespace)']]], + ['createalignmtb_1653',['createAlignMTB',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga2f1fafc885a5d79dbfb3542e08db0244',1,'cv::createAlignMTB()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga2f1fafc885a5d79dbfb3542e08db0244',1,'createAlignMTB()(Global Namespace)']]], + ['createamfilter_1654',['createAMFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gabb57336e67f7ea15d420e43f03823a11',1,'cv::ximgproc::createAMFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gabb57336e67f7ea15d420e43f03823a11',1,'createAMFilter()(Global Namespace)']]], + ['createaugmentedunscentedkalmanfilter_1655',['createAugmentedUnscentedKalmanFilter',['https://docs.opencv.org/4.2.0/da/dd0/namespacecv_1_1tracking.html#ad9ab42a3157dfbd2ac98fc42ad8fae4e',1,'cv::tracking']]], + ['createbackgroundsubtractorcnt_1656',['createBackgroundSubtractorCNT',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gab344bf148349e4cbeb3ed39efa9fbd2c',1,'cv::bgsegm::createBackgroundSubtractorCNT()'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gab344bf148349e4cbeb3ed39efa9fbd2c',1,'createBackgroundSubtractorCNT()(Global Namespace)']]], + ['createbackgroundsubtractorfgd_1657',['createBackgroundSubtractorFGD',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga56bc19f42734742cebf4f9b0837bc427',1,'cv::cuda::createBackgroundSubtractorFGD()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga56bc19f42734742cebf4f9b0837bc427',1,'createBackgroundSubtractorFGD()(Global Namespace)']]], + ['createbackgroundsubtractorgmg_1658',['createBackgroundSubtractorGMG',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gae561c9701970d0e6b35ec12bae149814',1,'cv::bgsegm::createBackgroundSubtractorGMG()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga87e2dcae3781a00327b42ed3920e502f',1,'cv::cuda::createBackgroundSubtractorGMG()'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gae561c9701970d0e6b35ec12bae149814',1,'createBackgroundSubtractorGMG(int initializationFrames=120, double decisionThreshold=0.8)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga87e2dcae3781a00327b42ed3920e502f',1,'createBackgroundSubtractorGMG(int initializationFrames=120, double decisionThreshold=0.8)(Global Namespace)']]], + ['createbackgroundsubtractorgsoc_1659',['createBackgroundSubtractorGSOC',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga7ba3e826c343adc15782ab9139f82445',1,'cv::bgsegm::createBackgroundSubtractorGSOC()'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga7ba3e826c343adc15782ab9139f82445',1,'createBackgroundSubtractorGSOC()(Global Namespace)']]], + ['createbackgroundsubtractorknn_1660',['createBackgroundSubtractorKNN',['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html#gac9be925771f805b6fdb614ec2292006d',1,'cv::createBackgroundSubtractorKNN()'],['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html#gac9be925771f805b6fdb614ec2292006d',1,'createBackgroundSubtractorKNN()(Global Namespace)']]], + ['createbackgroundsubtractorlsbp_1661',['createBackgroundSubtractorLSBP',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gaec3834f6a43f5bfda4d6bdd23c44d394',1,'cv::bgsegm::createBackgroundSubtractorLSBP()'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#gaec3834f6a43f5bfda4d6bdd23c44d394',1,'createBackgroundSubtractorLSBP()(Global Namespace)']]], + ['createbackgroundsubtractormog_1662',['createBackgroundSubtractorMOG',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga17d9525d2ad71f74d8d29c2c5e11903d',1,'cv::bgsegm::createBackgroundSubtractorMOG()'],['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html#ga6742648a654585013544eaa300f77b57',1,'cv::cuda::createBackgroundSubtractorMOG()'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga17d9525d2ad71f74d8d29c2c5e11903d',1,'createBackgroundSubtractorMOG(int history=200, int nmixtures=5, double backgroundRatio=0.7, double noiseSigma=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html#ga6742648a654585013544eaa300f77b57',1,'createBackgroundSubtractorMOG(int history=200, int nmixtures=5, double backgroundRatio=0.7, double noiseSigma=0)(Global Namespace)']]], + ['createbackgroundsubtractormog2_1663',['createBackgroundSubtractorMOG2',['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html#ga2beb2dee7a073809ccec60f145b6b29c',1,'cv::createBackgroundSubtractorMOG2()'],['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html#ga545102f6ffaa5cac18eb75d338598427',1,'cv::cuda::createBackgroundSubtractorMOG2()'],['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html#ga2beb2dee7a073809ccec60f145b6b29c',1,'createBackgroundSubtractorMOG2(int history=500, double varThreshold=16, bool detectShadows=true)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html#ga545102f6ffaa5cac18eb75d338598427',1,'createBackgroundSubtractorMOG2(int history=500, double varThreshold=16, bool detectShadows=true)(Global Namespace)']]], + ['createbfmatcher_1664',['createBFMatcher',['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#ac821657d8859f70c0592b91d7d48673c',1,'cv::cuda::DescriptorMatcher']]], + ['createbinarydescriptor_1665',['createBinaryDescriptor',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#ad896d4dfe36452cf01bd578f78d3062a',1,'cv::line_descriptor::BinaryDescriptor::createBinaryDescriptor()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#af5ff01839d73277260983900c9460a75',1,'cv::line_descriptor::BinaryDescriptor::createBinaryDescriptor(Params parameters)']]], + ['createbinarydescriptormatcher_1666',['createBinaryDescriptorMatcher',['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html#afd10bfe7d4ab8c952599745b088e9af2',1,'cv::line_descriptor::BinaryDescriptorMatcher']]], + ['createboxfilter_1667',['createBoxFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga3113b66e289bad7caef412e6e13ec2be',1,'cv::cuda::createBoxFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga3113b66e289bad7caef412e6e13ec2be',1,'createBoxFilter()(Global Namespace)']]], + ['createboxmaxfilter_1668',['createBoxMaxFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaaf4740c51128d23a37f6f1b22cee49e8',1,'cv::cuda::createBoxMaxFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaaf4740c51128d23a37f6f1b22cee49e8',1,'createBoxMaxFilter()(Global Namespace)']]], + ['createboxminfilter_1669',['createBoxMinFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga77fd36949bc8d92aabc120b4b1cfaafa',1,'cv::cuda::createBoxMinFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga77fd36949bc8d92aabc120b4b1cfaafa',1,'createBoxMinFilter()(Global Namespace)']]], + ['createbutton_1670',['createButton',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga938dc3ab0a9f115156439bd380816e2c',1,'cv::createButton()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga938dc3ab0a9f115156439bd380816e2c',1,'createButton()(Global Namespace)']]], + ['createcalibratedebevec_1671',['createCalibrateDebevec',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga7fed9707ad5f2cc0e633888867109f90',1,'cv::createCalibrateDebevec()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga7fed9707ad5f2cc0e633888867109f90',1,'createCalibrateDebevec()(Global Namespace)']]], + ['createcalibraterobertson_1672',['createCalibrateRobertson',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gae77813a21cd351a596619e5ff013be5d',1,'cv::createCalibrateRobertson()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gae77813a21cd351a596619e5ff013be5d',1,'createCalibrateRobertson()(Global Namespace)']]], + ['createcameraentity_1673',['createCameraEntity',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a015c89a8a6510ccc09e3395e651f62ac',1,'cv::ovis::WindowScene']]], + ['createcannyedgedetector_1674',['createCannyEdgeDetector',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gabc17953de36faa404acb07dc587451fc',1,'cv::cuda::createCannyEdgeDetector()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gabc17953de36faa404acb07dc587451fc',1,'createCannyEdgeDetector()(Global Namespace)']]], + ['createchihistogramcostextractor_1675',['createChiHistogramCostExtractor',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga914d5384804cb0fcc5eccc62a50b79ed',1,'cv::createChiHistogramCostExtractor()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga914d5384804cb0fcc5eccc62a50b79ed',1,'createChiHistogramCostExtractor()(Global Namespace)']]], + ['createclahe_1676',['createCLAHE',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gad689d2607b7b3889453804f414ab1018',1,'cv::createCLAHE()'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga950d3228b77b368a452553dcf57308c0',1,'cv::cuda::createCLAHE()'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#gad689d2607b7b3889453804f414ab1018',1,'createCLAHE(double clipLimit=40.0, Size tileGridSize=Size(8, 8))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga950d3228b77b368a452553dcf57308c0',1,'createCLAHE(double clipLimit=40.0, Size tileGridSize=Size(8, 8))(Global Namespace)']]], + ['createcolumnsumfilter_1677',['createColumnSumFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gac13bf7c41a34bfde2a7f33ad8caacfdf',1,'cv::cuda::createColumnSumFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gac13bf7c41a34bfde2a7f33ad8caacfdf',1,'createColumnSumFilter()(Global Namespace)']]], + ['createconcentricspherestestset_1678',['createConcentricSpheresTestSet',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ga28249d75f6dc48d8eae29731395f2027',1,'cv::ml::createConcentricSpheresTestSet()'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#ga28249d75f6dc48d8eae29731395f2027',1,'createConcentricSpheresTestSet()(Global Namespace)']]], + ['createcontinuous_1679',['createContinuous',['../classfilters_1_1KalmanFilter.html#ad3a6b07e72a76f916d04818f2be2810f',1,'filters::KalmanFilter::createContinuous()'],['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga3a55474eb59c884697edf397fe0f871c',1,'cv::cuda::createContinuous()'],['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga3a55474eb59c884697edf397fe0f871c',1,'createContinuous()(Global Namespace)']]], + ['createcontourfitting_1680',['createContourFitting',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#gadddbddafbb6eb9795246371772924c7c',1,'cv::ximgproc::createContourFitting()'],['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#gadddbddafbb6eb9795246371772924c7c',1,'createContourFitting()(Global Namespace)']]], + ['createconvolution_1681',['createConvolution',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga2695e05ef624bf3ce03cfbda383a821d',1,'cv::cuda::createConvolution()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga2695e05ef624bf3ce03cfbda383a821d',1,'createConvolution()(Global Namespace)']]], + ['createcovariancematrix_1682',['createCovarianceMatrix',['../namespacefilters_1_1statespace.html#a24d701aa77b14b0dee3e4a782bccb4b3',1,'filters::statespace']]], + ['createdatainstance_1683',['createDataInstance',['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#a214a5c797bf1aa889e81430dcfea596b',1,'cv::TLSData::createDataInstance()'],['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#a214a5c797bf1aa889e81430dcfea596b',1,'TLSData< cv::instr::NodeDataTls >::createDataInstance()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a08015abe3d6199e847e5bc23e2080f12',1,'cv::TLSDataAccumulator::createDataInstance()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a08015abe3d6199e847e5bc23e2080f12',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::createDataInstance()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#a13487b759ad6e80b5ac95171f5973027',1,'cv::TLSDataContainer::createDataInstance()']]], + ['createdefault_1684',['createDefault',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#ae5102a5ed5866711ba0e8347576307eb',1,'cv::detail::Blender::createDefault()'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#a72d0796c30091cdc686ad63ea46ebdc4',1,'cv::detail::ExposureCompensator::createDefault()'],['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html#acc8f6a3a6f6fe62ca55cdad655aab4b9',1,'cv::detail::SeamFinder::createDefault()'],['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#a2176b3377039b2851545e6d9de6f7b95',1,'cv::detail::Timelapser::createDefault()']]], + ['createderivfilter_1685',['createDerivFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga14d76dc6982ce739c67198f52bc16ee1',1,'cv::cuda::createDerivFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga14d76dc6982ce739c67198f52bc16ee1',1,'createDerivFilter()(Global Namespace)']]], + ['createdft_1686',['createDFT',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga0f72d063b73c8bb995678525eb076f10',1,'cv::cuda::createDFT()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga0f72d063b73c8bb995678525eb076f10',1,'createDFT()(Global Namespace)']]], + ['createdirectories_1687',['createDirectories',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#adc14f8d4f218ffd770ce57d4380d859f',1,'cv::utils::fs']]], + ['createdirectory_1688',['createDirectory',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html#ga67fef8eb0a66502901e995d9b3b2fb20',1,'cv::datasets::createDirectory()'],['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#aca64d8ee9509dc1db0acef5dbc807e6d',1,'cv::utils::fs::createDirectory()'],['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html#ga67fef8eb0a66502901e995d9b3b2fb20',1,'createDirectory()(Global Namespace)']]], + ['creatediscrete_1689',['createDiscrete',['../classfilters_1_1KalmanFilter.html#a67ad53d7267815441006a7f5c3a9fa63',1,'filters::KalmanFilter']]], + ['createdisparitybilateralfilter_1690',['createDisparityBilateralFilter',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#gaafb5f9902f7a9e74cb2cd4e680569590',1,'cv::cuda::createDisparityBilateralFilter()'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#gaafb5f9902f7a9e74cb2cd4e680569590',1,'createDisparityBilateralFilter()(Global Namespace)']]], + ['createdisparitywlsfilter_1691',['createDisparityWLSFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga8a351f67b897bb7cdaccaef115bafcac',1,'cv::ximgproc::createDisparityWLSFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga8a351f67b897bb7cdaccaef115bafcac',1,'createDisparityWLSFilter()(Global Namespace)']]], + ['createdisparitywlsfiltergeneric_1692',['createDisparityWLSFilterGeneric',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gad79c31494e3bb92d4b30e0dcefae1249',1,'cv::ximgproc::createDisparityWLSFilterGeneric()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gad79c31494e3bb92d4b30e0dcefae1249',1,'createDisparityWLSFilterGeneric()(Global Namespace)']]], + ['createdtfilter_1693',['createDTFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga9580eab93469544068f44882b5d24608',1,'cv::ximgproc::createDTFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga9580eab93469544068f44882b5d24608',1,'createDTFilter()(Global Namespace)']]], + ['createedgeawareinterpolator_1694',['createEdgeAwareInterpolator',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaadaeb21a59234d8f22d4465a641fe7be',1,'cv::ximgproc::createEdgeAwareInterpolator()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaadaeb21a59234d8f22d4465a641fe7be',1,'createEdgeAwareInterpolator()(Global Namespace)']]], + ['createedgeboxes_1695',['createEdgeBoxes',['https://docs.opencv.org/4.2.0/d4/d0d/group__ximgproc__edgeboxes.html#ga226d8e1a2dee5dfb58708b97f490b18a',1,'cv::ximgproc::createEdgeBoxes()'],['https://docs.opencv.org/4.2.0/d4/d0d/group__ximgproc__edgeboxes.html#ga226d8e1a2dee5dfb58708b97f490b18a',1,'createEdgeBoxes()(Global Namespace)']]], + ['createemdhistogramcostextractor_1696',['createEMDHistogramCostExtractor',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gafd12c095a67435368d86805f579b21c5',1,'cv::createEMDHistogramCostExtractor()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gafd12c095a67435368d86805f579b21c5',1,'createEMDHistogramCostExtractor()(Global Namespace)']]], + ['createemdl1histogramcostextractor_1697',['createEMDL1HistogramCostExtractor',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gab11979a83dfff08e4507b5e790594ee1',1,'cv::createEMDL1HistogramCostExtractor()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gab11979a83dfff08e4507b5e790594ee1',1,'createEMDL1HistogramCostExtractor()(Global Namespace)']]], + ['createentity_1698',['createEntity',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a08fdc90b961da70aaf58cad08a9e97d8',1,'cv::ovis::WindowScene']]], + ['createerfilternm1_1699',['createERFilterNM1',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga34e6b32cc3db805155ab51dcd7bc61d5',1,'cv::text::createERFilterNM1(const Ptr< ERFilter::Callback > &cb, int thresholdDelta=1, float minArea=(float) 0.00025, float maxArea=(float) 0.13, float minProbability=(float) 0.4, bool nonMaxSuppression=true, float minProbabilityDiff=(float) 0.1)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gad0dbf50d68acbacfbe466c4bc31cdcd2',1,'cv::text::createERFilterNM1(const String &filename, int thresholdDelta=1, float minArea=(float) 0.00025, float maxArea=(float) 0.13, float minProbability=(float) 0.4, bool nonMaxSuppression=true, float minProbabilityDiff=(float) 0.1)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga34e6b32cc3db805155ab51dcd7bc61d5',1,'createERFilterNM1(const Ptr< ERFilter::Callback > &cb, int thresholdDelta=1, float minArea=(float) 0.00025, float maxArea=(float) 0.13, float minProbability=(float) 0.4, bool nonMaxSuppression=true, float minProbabilityDiff=(float) 0.1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gad0dbf50d68acbacfbe466c4bc31cdcd2',1,'createERFilterNM1(const String &filename, int thresholdDelta=1, float minArea=(float) 0.00025, float maxArea=(float) 0.13, float minProbability=(float) 0.4, bool nonMaxSuppression=true, float minProbabilityDiff=(float) 0.1)(Global Namespace)']]], + ['createerfilternm2_1700',['createERFilterNM2',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga00f010f5b65cc60d1290a76807d39c95',1,'cv::text::createERFilterNM2(const Ptr< ERFilter::Callback > &cb, float minProbability=(float) 0.3)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga56f17c714f8403ef00b02022eeebb8a2',1,'cv::text::createERFilterNM2(const String &filename, float minProbability=(float) 0.3)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga00f010f5b65cc60d1290a76807d39c95',1,'createERFilterNM2(const Ptr< ERFilter::Callback > &cb, float minProbability=(float) 0.3)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga56f17c714f8403ef00b02022eeebb8a2',1,'createERFilterNM2(const String &filename, float minProbability=(float) 0.3)(Global Namespace)']]], + ['createfacedetectionmaskgenerator_1701',['createFaceDetectionMaskGenerator',['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ga9767823749e5e5df561593c2c85939cc',1,'cv::createFaceDetectionMaskGenerator()'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html#ga9767823749e5e5df561593c2c85939cc',1,'createFaceDetectionMaskGenerator()(Global Namespace)']]], + ['createfacemarkaam_1702',['createFacemarkAAM',['https://docs.opencv.org/4.2.0/d4/d48/namespacecv_1_1face.html#aedc268b74cfa8bbad74652e577345220',1,'cv::face']]], + ['createfacemarkkazemi_1703',['createFacemarkKazemi',['https://docs.opencv.org/4.2.0/d4/d48/namespacecv_1_1face.html#a2c5697c7d2bc0e76fc86e69b2378d9c9',1,'cv::face']]], + ['createfacemarklbf_1704',['createFacemarkLBF',['https://docs.opencv.org/4.2.0/d4/d48/namespacecv_1_1face.html#a0bec73a729ed878430c2feb9ce65bc2a',1,'cv::face']]], + ['createfastbilateralsolverfilter_1705',['createFastBilateralSolverFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga29d8ebf3499b69428db1d15d95513ca9',1,'cv::ximgproc::createFastBilateralSolverFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga29d8ebf3499b69428db1d15d95513ca9',1,'createFastBilateralSolverFilter()(Global Namespace)']]], + ['createfastglobalsmootherfilter_1706',['createFastGlobalSmootherFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga917687dcab45e44e1382134650c1f3d3',1,'cv::ximgproc::createFastGlobalSmootherFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga917687dcab45e44e1382134650c1f3d3',1,'createFastGlobalSmootherFilter()(Global Namespace)']]], + ['createfastlinedetector_1707',['createFastLineDetector',['https://docs.opencv.org/4.2.0/df/ded/group__ximgproc__fast__line__detector.html#gaa9636e5033cd2939ec50810f2b2bd853',1,'cv::ximgproc::createFastLineDetector()'],['https://docs.opencv.org/4.2.0/df/ded/group__ximgproc__fast__line__detector.html#gaa9636e5033cd2939ec50810f2b2bd853',1,'createFastLineDetector()(Global Namespace)']]], + ['createflags_1708',['CreateFlags',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa912544338415c5f8c8e55e85a139bfb',1,'cv::cuda::Event']]], + ['createframesource_5fcamera_1709',['createFrameSource_Camera',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga84e5f25bf81d7c9c2d03d90d84e7a3b4',1,'cv::superres::createFrameSource_Camera()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga84e5f25bf81d7c9c2d03d90d84e7a3b4',1,'createFrameSource_Camera()(Global Namespace)']]], + ['createframesource_5fempty_1710',['createFrameSource_Empty',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga5e43d87eeb716178a8e536b586ce7014',1,'cv::superres::createFrameSource_Empty()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga5e43d87eeb716178a8e536b586ce7014',1,'createFrameSource_Empty()(Global Namespace)']]], + ['createframesource_5fvideo_1711',['createFrameSource_Video',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gac6a56603cc8a807aed13eff65126954a',1,'cv::superres::createFrameSource_Video()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gac6a56603cc8a807aed13eff65126954a',1,'createFrameSource_Video()(Global Namespace)']]], + ['createframesource_5fvideo_5fcuda_1712',['createFrameSource_Video_CUDA',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga57219779f065060427f61038cc27fdd8',1,'cv::superres::createFrameSource_Video_CUDA()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga57219779f065060427f61038cc27fdd8',1,'createFrameSource_Video_CUDA()(Global Namespace)']]], + ['createfreetype2_1713',['createFreeType2',['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html#ga0fd8f9c0ae69bb4d95c41af79473a756',1,'cv::freetype::createFreeType2()'],['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html#ga0fd8f9c0ae69bb4d95c41af79473a756',1,'createFreeType2()(Global Namespace)']]], + ['creategaussianfilter_1714',['createGaussianFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaa4df286369114cfd4b144ae211f6a6c8',1,'cv::cuda::createGaussianFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaa4df286369114cfd4b144ae211f6a6c8',1,'createGaussianFilter()(Global Namespace)']]], + ['creategeneralizedhoughballard_1715',['createGeneralizedHoughBallard',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga3252811b8a7a5f606dc0a88927982ee9',1,'cv::createGeneralizedHoughBallard()'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#gab1ad5dc018f9b42d291aa4781d6ee620',1,'cv::cuda::createGeneralizedHoughBallard()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga3252811b8a7a5f606dc0a88927982ee9',1,'createGeneralizedHoughBallard()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#gab1ad5dc018f9b42d291aa4781d6ee620',1,'createGeneralizedHoughBallard()(Global Namespace)']]], + ['creategeneralizedhoughguil_1716',['createGeneralizedHoughGuil',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gae2eb1e12452257b63d09ba9ce871f58c',1,'cv::createGeneralizedHoughGuil()'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga4b0e2bd03af39ae97ab4f358aa5378ab',1,'cv::cuda::createGeneralizedHoughGuil()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gae2eb1e12452257b63d09ba9ce871f58c',1,'createGeneralizedHoughGuil()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga4b0e2bd03af39ae97ab4f358aa5378ab',1,'createGeneralizedHoughGuil()(Global Namespace)']]], + ['creategoodfeaturestotrackdetector_1717',['createGoodFeaturesToTrackDetector',['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html#ga478b474a598ece101f7e706fee2c8e91',1,'cv::cuda::createGoodFeaturesToTrackDetector()'],['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html#ga478b474a598ece101f7e706fee2c8e91',1,'createGoodFeaturesToTrackDetector()(Global Namespace)']]], + ['creategpumatheader_1718',['createGpuMatHeader',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a6444e4aa55f0c4cd6fcba072763106ff',1,'cv::cuda::HostMem']]], + ['creategraphsegmentation_1719',['createGraphSegmentation',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga5e3e721c5f16e34d3ad52b9eeb6d2860',1,'cv::ximgproc::segmentation::createGraphSegmentation()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga5e3e721c5f16e34d3ad52b9eeb6d2860',1,'createGraphSegmentation()(Global Namespace)']]], + ['creategrayworldwb_1720',['createGrayworldWB',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga6ecef774888036ddff15995512bdee39',1,'cv::xphoto::createGrayworldWB()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga6ecef774888036ddff15995512bdee39',1,'createGrayworldWB()(Global Namespace)']]], + ['creategridmesh_1721',['createGridMesh',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gaf483ecf2b3b15220f7a7aa1597b4eb54',1,'cv::ovis::createGridMesh()'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gaf483ecf2b3b15220f7a7aa1597b4eb54',1,'createGridMesh()(Global Namespace)']]], + ['createguidedfilter_1722',['createGuidedFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaf9f74771a6c947699be44592e8f0b61c',1,'cv::ximgproc::createGuidedFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaf9f74771a6c947699be44592e8f0b61c',1,'createGuidedFilter()(Global Namespace)']]], + ['createhanningwindow_1723',['createHanningWindow',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html#ga80e5c3de52f6bab3a7c1e60e89308e1b',1,'cv::createHanningWindow()'],['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html#ga80e5c3de52f6bab3a7c1e60e89308e1b',1,'createHanningWindow()(Global Namespace)']]], + ['createharriscorner_1724',['createHarrisCorner',['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html#ga3e5878a803e9bba51added0c10101979',1,'cv::cuda::createHarrisCorner()'],['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html#ga3e5878a803e9bba51added0c10101979',1,'createHarrisCorner()(Global Namespace)']]], + ['createhausdorffdistanceextractor_1725',['createHausdorffDistanceExtractor',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga1d058c5d00f6292da61422af2f3f4adc',1,'cv::createHausdorffDistanceExtractor()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga1d058c5d00f6292da61422af2f3f4adc',1,'createHausdorffDistanceExtractor()(Global Namespace)']]], + ['createheader_1726',['createHeader',['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html#a1d8f0bcae680f2386522bb3afc6dd262',1,'cv::cnn_3dobj::icoSphere']]], + ['createhoughcirclesdetector_1727',['createHoughCirclesDetector',['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga8e7921f114a5a4a3c85e86484c8f9597',1,'cv::cuda::createHoughCirclesDetector()'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga8e7921f114a5a4a3c85e86484c8f9597',1,'createHoughCirclesDetector()(Global Namespace)']]], + ['createhoughlinesdetector_1728',['createHoughLinesDetector',['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga1ac6e82a77233239dc20e14d1c21ddf9',1,'cv::cuda::createHoughLinesDetector()'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga1ac6e82a77233239dc20e14d1c21ddf9',1,'createHoughLinesDetector()(Global Namespace)']]], + ['createhoughsegmentdetector_1729',['createHoughSegmentDetector',['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga5a5959a24e8cb4da131bcffbf56b13cd',1,'cv::cuda::createHoughSegmentDetector()'],['https://docs.opencv.org/4.2.0/d2/d15/group__cudaimgproc__hough.html#ga5a5959a24e8cb4da131bcffbf56b13cd',1,'createHoughSegmentDetector()(Global Namespace)']]], + ['createimagepyramid_1730',['createImagePyramid',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gaeaa78f1925d1eb8605564ca159c7ae52',1,'cv::cuda::createImagePyramid()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gaeaa78f1925d1eb8605564ca159c7ae52',1,'createImagePyramid()(Global Namespace)']]], + ['createkernel_1731',['createKernel',['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga0e5694cf8dd380d512e915660870027c',1,'cv::ft::createKernel(InputArray A, InputArray B, OutputArray kernel, const int chn)'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga8b7e380f7e09f0efa30ca315f50bd214',1,'cv::ft::createKernel(int function, int radius, OutputArray kernel, const int chn)'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga0e5694cf8dd380d512e915660870027c',1,'createKernel(InputArray A, InputArray B, OutputArray kernel, const int chn)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga8b7e380f7e09f0efa30ca315f50bd214',1,'createKernel(int function, int radius, OutputArray kernel, const int chn)(Global Namespace)']]], + ['createlaplacepyr_1732',['createLaplacePyr',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#gac41bfd71102d3739962d6f034464e9ce',1,'cv::detail::createLaplacePyr()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#gac41bfd71102d3739962d6f034464e9ce',1,'createLaplacePyr()(Global Namespace)']]], + ['createlaplacepyrgpu_1733',['createLaplacePyrGpu',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga3cce24901db3d32e5bb0d3e31b67f622',1,'cv::detail::createLaplacePyrGpu()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga3cce24901db3d32e5bb0d3e31b67f622',1,'createLaplacePyrGpu()(Global Namespace)']]], + ['createlaplacianfilter_1734',['createLaplacianFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga53126e88bb7e6185dcd5628e28e42cd2',1,'cv::cuda::createLaplacianFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga53126e88bb7e6185dcd5628e28e42cd2',1,'createLaplacianFilter()(Global Namespace)']]], + ['createlayerinstance_1735',['createLayerInstance',['https://docs.opencv.org/4.2.0/d4/d67/classcv_1_1dnn_1_1LayerFactory.html#a850765f77a59a3c2f58eeb0e5a930ac3',1,'cv::dnn::LayerFactory']]], + ['createlearningbasedwb_1736',['createLearningBasedWB',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac8fb5636b27eac575f4a4c9c54dd1c7c',1,'cv::xphoto::createLearningBasedWB()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac8fb5636b27eac575f4a4c9c54dd1c7c',1,'createLearningBasedWB()(Global Namespace)']]], + ['createlightentity_1737',['createLightEntity',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#af82c1f760715911452b867263e74291d',1,'cv::ovis::WindowScene']]], + ['createlinearfilter_1738',['createLinearFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga57cb1804ad9d1280bf86433858daabf9',1,'cv::cuda::createLinearFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga57cb1804ad9d1280bf86433858daabf9',1,'createLinearFilter()(Global Namespace)']]], + ['createlinesegmentdetector_1739',['createLineSegmentDetector',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga6b2ad2353c337c42551b521a73eeae7d',1,'cv::createLineSegmentDetector()'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#ga6b2ad2353c337c42551b521a73eeae7d',1,'createLineSegmentDetector()(Global Namespace)']]], + ['createlookuptable_1740',['createLookUpTable',['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga2d9d9780dea8c5cd85d3c19b7e01979c',1,'cv::cuda::createLookUpTable()'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga2d9d9780dea8c5cd85d3c19b7e01979c',1,'createLookUpTable()(Global Namespace)']]], + ['createlsddetector_1741',['createLSDDetector',['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#a8de4c87977c2d3fa54b765df532cbf96',1,'cv::line_descriptor::LSDDetector::createLSDDetector()'],['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#a0b1881863371c04f4236255cf3b7c32d',1,'cv::line_descriptor::LSDDetector::createLSDDetector(LSDParam params)']]], + ['creatematheader_1742',['createMatHeader',['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a017b175a89135b3dd04c5825913e6b87',1,'cv::cuda::HostMem']]], + ['createmedianfilter_1743',['createMedianFilter',['https://docs.opencv.org/4.2.0/d1/d1a/namespacecv_1_1cuda.html#a154a3042e03f9f220db223216da8c9d0',1,'cv::cuda']]], + ['createmergedebevec_1744',['createMergeDebevec',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gaa8eab36bc764abb2a225db7c945f87f9',1,'cv::createMergeDebevec()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gaa8eab36bc764abb2a225db7c945f87f9',1,'createMergeDebevec()(Global Namespace)']]], + ['createmergemertens_1745',['createMergeMertens',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga79d59aa3cb3a7c664e59a4b5acc1ccb6',1,'cv::createMergeMertens()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga79d59aa3cb3a7c664e59a4b5acc1ccb6',1,'createMergeMertens()(Global Namespace)']]], + ['createmergerobertson_1746',['createMergeRobertson',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga460d4a1df1a7e8cdcf7445bb87a8fb78',1,'cv::createMergeRobertson()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga460d4a1df1a7e8cdcf7445bb87a8fb78',1,'createMergeRobertson()(Global Namespace)']]], + ['createmineigenvalcorner_1747',['createMinEigenValCorner',['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html#ga7457fd4b53b025f990b1c1dd1b749915',1,'cv::cuda::createMinEigenValCorner()'],['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html#ga7457fd4b53b025f990b1c1dd1b749915',1,'createMinEigenValCorner()(Global Namespace)']]], + ['createmorphologyfilter_1748',['createMorphologyFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gae58694e07be6bdbae126f36c75c08ee6',1,'cv::cuda::createMorphologyFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gae58694e07be6bdbae126f36c75c08ee6',1,'createMorphologyFilter()(Global Namespace)']]], + ['createnormhistogramcostextractor_1749',['createNormHistogramCostExtractor',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga1481005d6d11c15a6953c6a85d5f310d',1,'cv::createNormHistogramCostExtractor()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga1481005d6d11c15a6953c6a85d5f310d',1,'createNormHistogramCostExtractor()(Global Namespace)']]], + ['createocrhmmtransitionstable_1750',['createOCRHMMTransitionsTable',['https://docs.opencv.org/4.2.0/d8/de7/namespacecv_1_1text.html#a4ed3cbd46c1559f046cd25288a1f024b',1,'cv::text::createOCRHMMTransitionsTable(std::string &vocabulary, std::vector< std::string > &lexicon, OutputArray transition_probabilities_table)'],['https://docs.opencv.org/4.2.0/d8/de7/namespacecv_1_1text.html#adfc8fe61325b04caf837633f36f74c77',1,'cv::text::createOCRHMMTransitionsTable(const String &vocabulary, std::vector< cv::String > &lexicon)']]], + ['createoneelemsets_1751',['createOneElemSets',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#a840589dd0b4786c04f7505d238b60531',1,'cv::detail::DisjointSets']]], + ['createoptflow_5fbrox_5fcuda_1752',['createOptFlow_Brox_CUDA',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga9aa098f573b34c2640dde7141cb7341e',1,'cv::superres::createOptFlow_Brox_CUDA()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga9aa098f573b34c2640dde7141cb7341e',1,'createOptFlow_Brox_CUDA()(Global Namespace)']]], + ['createoptflow_5fdeepflow_1753',['createOptFlow_DeepFlow',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga5e735547610172695cb0b39495af9d6d',1,'cv::optflow::createOptFlow_DeepFlow()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga5e735547610172695cb0b39495af9d6d',1,'createOptFlow_DeepFlow()(Global Namespace)']]], + ['createoptflow_5fdenserlof_1754',['createOptFlow_DenseRLOF',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga6c01ebcd843767fd4bd754f4238dc72c',1,'cv::optflow::createOptFlow_DenseRLOF()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga6c01ebcd843767fd4bd754f4238dc72c',1,'createOptFlow_DenseRLOF()(Global Namespace)']]], + ['createoptflow_5fdualtvl1_1755',['createOptFlow_DualTVL1',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga132098d4d6e74b96c715bb9c451a1d8f',1,'cv::optflow::createOptFlow_DualTVL1()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gadf0096066f129679ccec36355a013b1f',1,'cv::superres::createOptFlow_DualTVL1()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga132098d4d6e74b96c715bb9c451a1d8f',1,'createOptFlow_DualTVL1()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gadf0096066f129679ccec36355a013b1f',1,'createOptFlow_DualTVL1()(Global Namespace)']]], + ['createoptflow_5fdualtvl1_5fcuda_1756',['createOptFlow_DualTVL1_CUDA',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga1ff741c2af0d33d51cf789a926e71481',1,'cv::superres::createOptFlow_DualTVL1_CUDA()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga1ff741c2af0d33d51cf789a926e71481',1,'createOptFlow_DualTVL1_CUDA()(Global Namespace)']]], + ['createoptflow_5ffarneback_1757',['createOptFlow_Farneback',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gadd1519b8b360c101de0a2d3d3ca5f0e1',1,'cv::optflow::createOptFlow_Farneback()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga7cda87ef90a39c812915300cb3bb615a',1,'cv::superres::createOptFlow_Farneback()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gadd1519b8b360c101de0a2d3d3ca5f0e1',1,'createOptFlow_Farneback()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga7cda87ef90a39c812915300cb3bb615a',1,'createOptFlow_Farneback()(Global Namespace)']]], + ['createoptflow_5ffarneback_5fcuda_1758',['createOptFlow_Farneback_CUDA',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga2a9ff64ab93b3c6df988ce33ed1a9e48',1,'cv::superres::createOptFlow_Farneback_CUDA()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga2a9ff64ab93b3c6df988ce33ed1a9e48',1,'createOptFlow_Farneback_CUDA()(Global Namespace)']]], + ['createoptflow_5fpcaflow_1759',['createOptFlow_PCAFlow',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gabbf0942f6ab840dcb1c10273b02507f0',1,'cv::optflow::createOptFlow_PCAFlow()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gabbf0942f6ab840dcb1c10273b02507f0',1,'createOptFlow_PCAFlow()(Global Namespace)']]], + ['createoptflow_5fpyrlk_5fcuda_1760',['createOptFlow_PyrLK_CUDA',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gaf88e3b7fbb6c32cec4c802dcb079400c',1,'cv::superres::createOptFlow_PyrLK_CUDA()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gaf88e3b7fbb6c32cec4c802dcb079400c',1,'createOptFlow_PyrLK_CUDA()(Global Namespace)']]], + ['createoptflow_5fsimpleflow_1761',['createOptFlow_SimpleFlow',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gab3fd0cd6d32cb7cfa169cb72e804d0b4',1,'cv::optflow::createOptFlow_SimpleFlow()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gab3fd0cd6d32cb7cfa169cb72e804d0b4',1,'createOptFlow_SimpleFlow()(Global Namespace)']]], + ['createoptflow_5fsparserlof_1762',['createOptFlow_SparseRLOF',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gadcd2f4b1ecb8ea366bdc23f8f23da7ac',1,'cv::optflow::createOptFlow_SparseRLOF()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gadcd2f4b1ecb8ea366bdc23f8f23da7ac',1,'createOptFlow_SparseRLOF()(Global Namespace)']]], + ['createoptflow_5fsparsetodense_1763',['createOptFlow_SparseToDense',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gae7bcbdec27f2006dde666c5f6c6e232d',1,'cv::optflow::createOptFlow_SparseToDense()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#gae7bcbdec27f2006dde666c5f6c6e232d',1,'createOptFlow_SparseToDense()(Global Namespace)']]], + ['createopticalflowneedlemap_1764',['createOpticalFlowNeedleMap',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga0d285cee95d6c70d4976ef191726c1f1',1,'cv::cuda::createOpticalFlowNeedleMap()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga0d285cee95d6c70d4976ef191726c1f1',1,'createOpticalFlowNeedleMap()(Global Namespace)']]], + ['createplanemesh_1765',['createPlaneMesh',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga9214437e592ecc604c736b3575cee5e5',1,'cv::ovis::createPlaneMesh()'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga9214437e592ecc604c736b3575cee5e5',1,'createPlaneMesh()(Global Namespace)']]], + ['createpointcloudmesh_1766',['createPointCloudMesh',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gae9f76a970c4762f125957b3541b4ad3f',1,'cv::ovis::createPointCloudMesh()'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gae9f76a970c4762f125957b3541b4ad3f',1,'createPointCloudMesh()(Global Namespace)']]], + ['createquaternionimage_1767',['createQuaternionImage',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga7e05deed15f29e96b90be1042ef94221',1,'cv::ximgproc::createQuaternionImage()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga7e05deed15f29e96b90be1042ef94221',1,'createQuaternionImage()(Global Namespace)']]], + ['createrffeaturegetter_1768',['createRFFeatureGetter',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html#ga46b9bc71471f61bcbbc05922a1d6db08',1,'cv::ximgproc::createRFFeatureGetter()'],['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html#ga46b9bc71471f61bcbbc05922a1d6db08',1,'createRFFeatureGetter()(Global Namespace)']]], + ['createricinterpolator_1769',['createRICInterpolator',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaa68a46e3af5b9d45e5b5cc4dac7e6240',1,'cv::ximgproc::createRICInterpolator()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gaa68a46e3af5b9d45e5b5cc4dac7e6240',1,'createRICInterpolator()(Global Namespace)']]], + ['createrightmatcher_1770',['createRightMatcher',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gae85b598094c2d747f84f22b2aa2c2e0c',1,'cv::ximgproc::createRightMatcher()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#gae85b598094c2d747f84f22b2aa2c2e0c',1,'createRightMatcher()(Global Namespace)']]], + ['createrleimage_1771',['createRLEImage',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#gaeb612dd95fb84622846dbb516af7ab88',1,'cv::ximgproc::rl::createRLEImage()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#gaeb612dd95fb84622846dbb516af7ab88',1,'createRLEImage()(Global Namespace)']]], + ['createrowsumfilter_1772',['createRowSumFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaf735de273ccb5072f3c27816fb97a53a',1,'cv::cuda::createRowSumFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaf735de273ccb5072f3c27816fb97a53a',1,'createRowSumFilter()(Global Namespace)']]], + ['createsamesize_1773',['createSameSize',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ae3ba8e4898c218ec5bd19ec0bf2217e0',1,'cv::_OutputArray']]], + ['createscharrfilter_1774',['createScharrFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga4ac8df158e5771ddb0bd5c9091188ce6',1,'cv::cuda::createScharrFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#ga4ac8df158e5771ddb0bd5c9091188ce6',1,'createScharrFilter()(Global Namespace)']]], + ['createselectivesearchsegmentation_1775',['createSelectiveSearchSegmentation',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga79725490f59e23bba3c774239aa053f1',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentation()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga79725490f59e23bba3c774239aa053f1',1,'createSelectiveSearchSegmentation()(Global Namespace)']]], + ['createselectivesearchsegmentationstrategycolor_1776',['createSelectiveSearchSegmentationStrategyColor',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga28d5bd8d3a9dc8a7c53a4df5ee01421d',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyColor()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga28d5bd8d3a9dc8a7c53a4df5ee01421d',1,'createSelectiveSearchSegmentationStrategyColor()(Global Namespace)']]], + ['createselectivesearchsegmentationstrategyfill_1777',['createSelectiveSearchSegmentationStrategyFill',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga6da434bbb8e34a4f2b4bef838119b7d9',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyFill()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga6da434bbb8e34a4f2b4bef838119b7d9',1,'createSelectiveSearchSegmentationStrategyFill()(Global Namespace)']]], + ['createselectivesearchsegmentationstrategymultiple_1778',['createSelectiveSearchSegmentationStrategyMultiple',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#gaa03c4fdeb0239fc53872a5f941702d4b',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyMultiple()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#gafae74f2d165a207d7c304c66cd9cdf92',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga6a1ee28fec2ccd0c68883fb47ce09732',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1, Ptr< SelectiveSearchSegmentationStrategy > s2)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga1bb0b891b255865f9e1000649d9b693d',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1, Ptr< SelectiveSearchSegmentationStrategy > s2, Ptr< SelectiveSearchSegmentationStrategy > s3)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#gac81ad5c23350c56112dfd1434f76276c',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1, Ptr< SelectiveSearchSegmentationStrategy > s2, Ptr< SelectiveSearchSegmentationStrategy > s3, Ptr< SelectiveSearchSegmentationStrategy > s4)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#gaa03c4fdeb0239fc53872a5f941702d4b',1,'createSelectiveSearchSegmentationStrategyMultiple()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#gafae74f2d165a207d7c304c66cd9cdf92',1,'createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga6a1ee28fec2ccd0c68883fb47ce09732',1,'createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1, Ptr< SelectiveSearchSegmentationStrategy > s2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga1bb0b891b255865f9e1000649d9b693d',1,'createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1, Ptr< SelectiveSearchSegmentationStrategy > s2, Ptr< SelectiveSearchSegmentationStrategy > s3)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#gac81ad5c23350c56112dfd1434f76276c',1,'createSelectiveSearchSegmentationStrategyMultiple(Ptr< SelectiveSearchSegmentationStrategy > s1, Ptr< SelectiveSearchSegmentationStrategy > s2, Ptr< SelectiveSearchSegmentationStrategy > s3, Ptr< SelectiveSearchSegmentationStrategy > s4)(Global Namespace)']]], + ['createselectivesearchsegmentationstrategysize_1779',['createSelectiveSearchSegmentationStrategySize',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga2ddd826e91ca387c263588a863b677e3',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategySize()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga2ddd826e91ca387c263588a863b677e3',1,'createSelectiveSearchSegmentationStrategySize()(Global Namespace)']]], + ['createselectivesearchsegmentationstrategytexture_1780',['createSelectiveSearchSegmentationStrategyTexture',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga4220f4bdb88c0a1a78fe703b7e7f44df',1,'cv::ximgproc::segmentation::createSelectiveSearchSegmentationStrategyTexture()'],['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html#ga4220f4bdb88c0a1a78fe703b7e7f44df',1,'createSelectiveSearchSegmentationStrategyTexture()(Global Namespace)']]], + ['createseparablelinearfilter_1781',['createSeparableLinearFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaf7b79a9a92992044f328dad07a52c4bf',1,'cv::cuda::createSeparableLinearFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gaf7b79a9a92992044f328dad07a52c4bf',1,'createSeparableLinearFilter()(Global Namespace)']]], + ['createshapecontextdistanceextractor_1782',['createShapeContextDistanceExtractor',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga3cd728c70ce6284d30189cb9e63a6bd3',1,'cv::createShapeContextDistanceExtractor()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga3cd728c70ce6284d30189cb9e63a6bd3',1,'createShapeContextDistanceExtractor()(Global Namespace)']]], + ['createsimplewb_1783',['createSimpleWB',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga2b48b3b384b5c5ee1b15a2a01c26d5f1',1,'cv::xphoto::createSimpleWB()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga2b48b3b384b5c5ee1b15a2a01c26d5f1',1,'createSimpleWB()(Global Namespace)']]], + ['createsobelfilter_1784',['createSobelFilter',['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gabf85fe61958bb21e93211a6fcc7c5c3b',1,'cv::cuda::createSobelFilter()'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html#gabf85fe61958bb21e93211a6fcc7c5c3b',1,'createSobelFilter()(Global Namespace)']]], + ['createstereobeliefpropagation_1785',['createStereoBeliefPropagation',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#ga8d22dd80bdfb4e3d7d2ac09e8a07c22b',1,'cv::cuda::createStereoBeliefPropagation()'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#ga8d22dd80bdfb4e3d7d2ac09e8a07c22b',1,'createStereoBeliefPropagation()(Global Namespace)']]], + ['createstereobm_1786',['createStereoBM',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#ga77edc901350dd0a7f46ec5aca4138039',1,'cv::cuda::createStereoBM()'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#ga77edc901350dd0a7f46ec5aca4138039',1,'createStereoBM()(Global Namespace)']]], + ['createstereoconstantspacebp_1787',['createStereoConstantSpaceBP',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#gaec3b49c7cf9f7701a6f549a227be4df2',1,'cv::cuda::createStereoConstantSpaceBP()'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#gaec3b49c7cf9f7701a6f549a227be4df2',1,'createStereoConstantSpaceBP()(Global Namespace)']]], + ['createstitcher_1788',['createStitcher',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga2de00132401436e7ddc89590994fd922',1,'cv::createStitcher()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga2de00132401436e7ddc89590994fd922',1,'createStitcher()(Global Namespace)']]], + ['createstitcherscans_1789',['createStitcherScans',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga5b928eb0ff52ec148f6cfa89b6a0af25',1,'cv::createStitcherScans()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga5b928eb0ff52ec148f6cfa89b6a0af25',1,'createStitcherScans()(Global Namespace)']]], + ['createstructurededgedetection_1790',['createStructuredEdgeDetection',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html#ga39029b3c6691b0314b53c68c79d5b788',1,'cv::ximgproc::createStructuredEdgeDetection()'],['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html#ga39029b3c6691b0314b53c68c79d5b788',1,'createStructuredEdgeDetection()(Global Namespace)']]], + ['createsuperpixellsc_1791',['createSuperpixelLSC',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#ga437341bd2bc5c7a9806450063fd5c5a3',1,'cv::ximgproc::createSuperpixelLSC()'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#ga437341bd2bc5c7a9806450063fd5c5a3',1,'createSuperpixelLSC()(Global Namespace)']]], + ['createsuperpixelseeds_1792',['createSuperpixelSEEDS',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gabda19d839f775cbb527fffec133bc4ea',1,'cv::ximgproc::createSuperpixelSEEDS()'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gabda19d839f775cbb527fffec133bc4ea',1,'createSuperpixelSEEDS()(Global Namespace)']]], + ['createsuperpixelslic_1793',['createSuperpixelSLIC',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gacf29df20eaca242645a8d3a2d88e6c06',1,'cv::ximgproc::createSuperpixelSLIC()'],['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html#gacf29df20eaca242645a8d3a2d88e6c06',1,'createSuperpixelSLIC()(Global Namespace)']]], + ['createsuperresolution_5fbtvl1_1794',['createSuperResolution_BTVL1',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga73c184b0040c1afa7d6cdf0a9f32a8f8',1,'cv::superres::createSuperResolution_BTVL1()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#ga73c184b0040c1afa7d6cdf0a9f32a8f8',1,'createSuperResolution_BTVL1()(Global Namespace)']]], + ['createsuperresolution_5fbtvl1_5fcuda_1795',['createSuperResolution_BTVL1_CUDA',['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gaea2902c2e948f7629df286252d598c4d',1,'cv::superres::createSuperResolution_BTVL1_CUDA()'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html#gaea2902c2e948f7629df286252d598c4d',1,'createSuperResolution_BTVL1_CUDA()(Global Namespace)']]], + ['createsyntheticsequencegenerator_1796',['createSyntheticSequenceGenerator',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga4dcae4825e43d6ba54487ddc7a85cbb4',1,'cv::bgsegm::createSyntheticSequenceGenerator()'],['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html#ga4dcae4825e43d6ba54487ddc7a85cbb4',1,'createSyntheticSequenceGenerator()(Global Namespace)']]], + ['createtemplatematching_1797',['createTemplateMatching',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gad23350ed16d9b010d96c5ef76ccc29d0',1,'cv::cuda::createTemplateMatching()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gad23350ed16d9b010d96c5ef76ccc29d0',1,'createTemplateMatching()(Global Namespace)']]], + ['createthinplatesplineshapetransformer_1798',['createThinPlateSplineShapeTransformer',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga624261564326d735bc6af7cb4e27bb95',1,'cv::createThinPlateSplineShapeTransformer()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#ga624261564326d735bc6af7cb4e27bb95',1,'createThinPlateSplineShapeTransformer()(Global Namespace)']]], + ['createtonemap_1799',['createTonemap',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gabcbd653140b93a1fa87ccce94548cd0d',1,'cv::createTonemap()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gabcbd653140b93a1fa87ccce94548cd0d',1,'createTonemap()(Global Namespace)']]], + ['createtonemapdrago_1800',['createTonemapDrago',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga72bf92bb6b8653ee4be650ac01cf50b6',1,'cv::createTonemapDrago()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga72bf92bb6b8653ee4be650ac01cf50b6',1,'createTonemapDrago()(Global Namespace)']]], + ['createtonemapdurand_1801',['createTonemapDurand',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gaa260080c493ecc2c639610eddef00cbf',1,'cv::xphoto::createTonemapDurand()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gaa260080c493ecc2c639610eddef00cbf',1,'createTonemapDurand()(Global Namespace)']]], + ['createtonemapmantiuk_1802',['createTonemapMantiuk',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga3b3f3bf083b7515802f039a6a70f2d21',1,'cv::createTonemapMantiuk()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#ga3b3f3bf083b7515802f039a6a70f2d21',1,'createTonemapMantiuk()(Global Namespace)']]], + ['createtonemapreinhard_1803',['createTonemapReinhard',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gadabe7f6bf1fa96ad0fd644df9182c2fb',1,'cv::createTonemapReinhard()'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gadabe7f6bf1fa96ad0fd644df9182c2fb',1,'createTonemapReinhard()(Global Namespace)']]], + ['createtrackbar_1804',['createTrackbar',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gaf78d2155d30b728fc413803745b67a9b',1,'cv::createTrackbar()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gaf78d2155d30b728fc413803745b67a9b',1,'createTrackbar()(Global Namespace)']]], + ['createtrackerbymatching_1805',['createTrackerByMatching',['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#adf142df760e16bcd832478934598e2d0',1,'cv::tbm']]], + ['createtrianglemesh_1806',['createTriangleMesh',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga5648ab6b81d2764eb1865ca55fe95e80',1,'cv::ovis::createTriangleMesh()'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga5648ab6b81d2764eb1865ca55fe95e80',1,'createTriangleMesh()(Global Namespace)']]], + ['createunscentedkalmanfilter_1807',['createUnscentedKalmanFilter',['https://docs.opencv.org/4.2.0/da/dd0/namespacecv_1_1tracking.html#a96e8c1ceaef27ab6f87cc414a7a7ee6a',1,'cv::tracking']]], + ['createvideoreader_1808',['createVideoReader',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gafd67042ff937f5152fa1b682c5c589ed',1,'cv::cudacodec::createVideoReader(const String &filename)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gac5a44b5a3d7b50ce7bcafaf75a2cfedf',1,'cv::cudacodec::createVideoReader(const Ptr< RawVideoSource > &source)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gafd67042ff937f5152fa1b682c5c589ed',1,'createVideoReader(const String &filename)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gac5a44b5a3d7b50ce7bcafaf75a2cfedf',1,'createVideoReader(const Ptr< RawVideoSource > &source)(Global Namespace)']]], + ['createvideowriter_1809',['createVideoWriter',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga265e7194b875468be41f5b1a008c622f',1,'cv::cudacodec::createVideoWriter(const String &fileName, Size frameSize, double fps, SurfaceFormat format=SF_BGR)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga6478d4c46cb033e9fcf49b458291fe52',1,'cv::cudacodec::createVideoWriter(const String &fileName, Size frameSize, double fps, const EncoderParams &params, SurfaceFormat format=SF_BGR)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga6773e8f1e9c05cc801234a694862b3e2',1,'cv::cudacodec::createVideoWriter(const Ptr< EncoderCallBack > &encoderCallback, Size frameSize, double fps, SurfaceFormat format=SF_BGR)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga14b9eec8c0c5bbbce0da1884c51f8173',1,'cv::cudacodec::createVideoWriter(const Ptr< EncoderCallBack > &encoderCallback, Size frameSize, double fps, const EncoderParams &params, SurfaceFormat format=SF_BGR)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga265e7194b875468be41f5b1a008c622f',1,'createVideoWriter(const String &fileName, Size frameSize, double fps, SurfaceFormat format=SF_BGR)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga6478d4c46cb033e9fcf49b458291fe52',1,'createVideoWriter(const String &fileName, Size frameSize, double fps, const EncoderParams &params, SurfaceFormat format=SF_BGR)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga6773e8f1e9c05cc801234a694862b3e2',1,'createVideoWriter(const Ptr< EncoderCallBack > &encoderCallback, Size frameSize, double fps, SurfaceFormat format=SF_BGR)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#ga14b9eec8c0c5bbbce0da1884c51f8173',1,'createVideoWriter(const Ptr< EncoderCallBack > &encoderCallback, Size frameSize, double fps, const EncoderParams &params, SurfaceFormat format=SF_BGR)(Global Namespace)']]], + ['createweightmap_1810',['createWeightMap',['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga44acdfd65d4502ff8d66ee9efd5cb2c9',1,'cv::detail::createWeightMap()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga44acdfd65d4502ff8d66ee9efd5cb2c9',1,'createWeightMap()(Global Namespace)']]], + ['createweightmaps_1811',['createWeightMaps',['https://docs.opencv.org/4.2.0/d4/d69/classcv_1_1detail_1_1FeatherBlender.html#a8ce9b0e8ccc9cbf68d935782e14e37d3',1,'cv::detail::FeatherBlender']]], + ['createwindow_1812',['createWindow',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gae540577f6f783d26c37319663c8245ad',1,'cv::ovis::createWindow()'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gae540577f6f783d26c37319663c8245ad',1,'createWindow(const String &title, const Size &size, int flags=SCENE_INTERACTIVE|SCENE_AA)(Global Namespace)']]], + ['creating_20a_203d_20histogram_1813',['Creating a 3D histogram',['https://docs.opencv.org/4.2.0/d1/d1d/tutorial_histo3D.html',1,'']]], + ['creating_20a_20video_20with_20opencv_1814',['Creating a video with OpenCV',['https://docs.opencv.org/4.2.0/d7/d9e/tutorial_video_write.html',1,'']]], + ['creating_20bounding_20boxes_20and_20circles_20for_20contours_1815',['Creating Bounding boxes and circles for contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'']]], + ['creating_20bounding_20rotated_20boxes_20and_20ellipses_20for_20contours_1816',['Creating Bounding rotated boxes and ellipses for contours',['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'']]], + ['creating_20groups_1817',['Creating Groups',['https://docs.opencv.org/4.2.0/d1/d8b/tutorial_hdf_create_groups.html',1,'']]], + ['creating_20widgets_1818',['Creating Widgets',['https://docs.opencv.org/4.2.0/d2/d64/tutorial_creating_widgets.html',1,'']]], + ['creating_20writing_20and_20reading_20datasets_1819',['Creating, Writing and Reading Datasets',['https://docs.opencv.org/4.2.0/d4/d93/tutorial_hdf_create_read_write_datasets.html',1,'']]], + ['creating_20your_20own_20corner_20detector_1820',['Creating your own corner detector',['https://docs.opencv.org/4.2.0/d9/dbc/tutorial_generic_corner_detector.html',1,'']]], + ['creating_5fwidgets_2emarkdown_1821',['creating_widgets.markdown',['https://docs.opencv.org/4.2.0/da/d9a/creating__widgets_8markdown.html',1,'']]], + ['creation_20functions_1822',['Array creation functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01523.html',1,'']]], + ['creative_20senz3d_20and_20other_20intel_20perceptual_20computing_20sdk_20compatible_20depth_20sensors_1823',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], + ['cref_1824',['cref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afc6f7bb2ebc4f03c54cdf91f5ecb1f15',1,'std::cref(const _Tp &__t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2368fbf8f54b8df5ea09bd447dd07ab5',1,'std::cref(const _Tp &&)=delete'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a173f93c3bca58d0411f16989cce6fedc',1,'std::cref(reference_wrapper< _Tp > __t) noexcept']]], + ['cregex_5ftoken_5fiterator_1825',['cregex_token_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga2b025ba2913cd0f7266ddbea7eb2c915',1,'std::cregex_token_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga2b025ba2913cd0f7266ddbea7eb2c915',1,'cregex_token_iterator(Global Namespace)']]], + ['crend_1826',['crend',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#af1e98d795f3b288cff0e0ead0b882634',1,'__gnu_cxx::__versa_string::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< _CharT >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< _CharT, _Traits, _Allocator >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< char >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< char, char_traits< char >, _Byte_alloc >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< char_type, _Traits, _Alloc >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'basic_string< value_type >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a17d738d29f26320ce991399537a17bce',1,'deque< _StateSeqT >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#af9bc7bbe49c3f41b0dfaa3acd5c89e12',1,'list< __inp, __rebind_inp >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'match_results< _Bi_iter >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a9b78c09c0de7008f035df7238fe4b925',1,'std::basic_string::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a17d738d29f26320ce991399537a17bce',1,'std::deque::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#af9bc7bbe49c3f41b0dfaa3acd5c89e12',1,'std::list::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#adbd5c263f187f16ca9f073e1789a02ff',1,'std::map::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'std::match_results::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a5677edc45a056a95ea1455378f2aa903',1,'std::multimap::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a23f0dc41c6813e1628a1acf9c1966c8b',1,'std::multiset::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#abb253be090c388adfba1f54046c0f416',1,'std::set::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'std::vector::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< __diff_type >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _CharClassT >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _CharT >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _Cmpt >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _Node *, _Nodeptr_Alloc >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _RealType >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _State< _TraitsT::char_type > >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< _StringT >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< block_type, allocator_type >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< Catalog_info * >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< double >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< int >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< result_type >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< size_t >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< std::pair< _BiIter, int > >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< std::pair< _StateIdT, std::vector > >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< std::pair< _StrTransT, _StrTransT > >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< sub_match< _Bi_iter >, _Alloc >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a825800ea90d4e7367b5361ae53f864c7',1,'vector< sub_match< _BiIter >, _Alloc >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'Eigen::VectorwiseOp::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const Derived, Horizontal >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const Derived, Vertical >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::crend()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23fa202916349d11e476f459543395ef',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::crend()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a223480466a0922267d680ec8f0722d58.html#a223480466a0922267d680ec8f0722d58',1,'nlohmann::basic_json::crend()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a302a9b43f7a45e54827072d23d6682f5',1,'std::crend()']]], + ['crop_1827',['CROP',['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#af76d4f81be079787300899fbfaaf92d3af0f3167875e479f3b72c2c2917077b58',1,'cv::detail::Timelapser']]], + ['crop_1828',['crop',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gae72ac2d6fec8d4e636a7d72d37e70895',1,'cv::gapi::crop()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gae72ac2d6fec8d4e636a7d72d37e70895',1,'crop()(Global Namespace)']]], + ['cropandresizelayer_1829',['CropAndResizeLayer',['https://docs.opencv.org/4.2.0/d8/d53/classcv_1_1dnn_1_1CropAndResizeLayer.html',1,'cv::dnn']]], + ['croplayer_1830',['CropLayer',['https://docs.opencv.org/4.2.0/d7/d86/classcv_1_1dnn_1_1CropLayer.html',1,'cv::dnn']]], + ['cross_1831',['cross',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a708b761e0d15b7b8db4c8e8c95a7abe9',1,'cv::Mat::cross()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac0309f2c3e9df59cbe1315b671040da2',1,'cv::Mat_::cross()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac0309f2c3e9df59cbe1315b671040da2',1,'Mat_< double >::cross()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac0309f2c3e9df59cbe1315b671040da2',1,'Mat_< float >::cross()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac0309f2c3e9df59cbe1315b671040da2',1,'Mat_< uchar >::cross()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac0309f2c3e9df59cbe1315b671040da2',1,'Mat_< unsigned char >::cross()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8bf0a7608d14009f0e946f35b813ccaa',1,'cv::MatExpr::cross()'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a4f8bf249885e00c31a4f63565bf4df15',1,'cv::Point3_::cross()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a946769d5545dba5d328486602aae2ac3',1,'cv::Point_::cross()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a946769d5545dba5d328486602aae2ac3',1,'Point_< double >::cross()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a946769d5545dba5d328486602aae2ac3',1,'Point_< float >::cross()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a946769d5545dba5d328486602aae2ac3',1,'Point_< int >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'cv::Vec::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< _Tp, 4 >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< double, 2 >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< double, 3 >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< double, 4 >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< double, GPCPatchDescriptor::nFeatures >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< double, nFeatures >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< float, 2 >::cross()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aeb91d64fc995b155a99ded4fb1520295',1,'Vec< float, 3 >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga0024b44eca99cb7135887c2aaf319d28',1,'Eigen::MatrixBase::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga0024b44eca99cb7135887c2aaf319d28',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga0024b44eca99cb7135887c2aaf319d28',1,'MatrixBase< Solve< Decomposition, RhsType > >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'Eigen::VectorwiseOp::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const Derived, Horizontal >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const Derived, Vertical >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::cross()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga2fe1a2a012ce0ab0e8da6af134073039',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::cross()'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac486a777bd8cd6f37ada22cdd8c09f49',1,'cross(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac486a777bd8cd6f37ada22cdd8c09f49',1,'cv::datasets::cross'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac486a777bd8cd6f37ada22cdd8c09f49',1,'cross(Global Namespace)'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga0024b44eca99cb7135887c2aaf319d28',1,'cross(const MatrixBase< OtherDerived > &other) const(Global Namespace)']]], + ['cross_20compilation_20for_20arm_20based_20linux_20systems_1832',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]], + ['cross_20referencing_20opencv_20from_20other_20doxygen_20projects_1833',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], + ['cross3_1834',['cross3',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gabde56e2a0baba550815a0b05139e4d42',1,'Eigen::MatrixBase::cross3()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gabde56e2a0baba550815a0b05139e4d42',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::cross3()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gabde56e2a0baba550815a0b05139e4d42',1,'MatrixBase< Solve< Decomposition, RhsType > >::cross3()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#gabde56e2a0baba550815a0b05139e4d42',1,'cross3()(Global Namespace)']]], + ['crosscheck_1835',['crossCheck',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#a4fd61f0e8a770d4a23c47e7f6240c6ba',1,'cv::BFMatcher']]], + ['crossings_1836',['crossings',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a36855f1539c64327dbef1fed241a8219',1,'cv::text::ERStat']]], + ['crosssegmentationthreshold_1837',['crossSegmentationThreshold',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#aee99954ef8164f5441dcf10e08121313',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['csetjmp_1838',['csetjmp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00218.html',1,'']]], + ['cshift_1839',['cshift',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5763723f8e15f612889a2d93625649db',1,'std::valarray::cshift()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5763723f8e15f612889a2d93625649db',1,'valarray< size_t >::cshift()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5763723f8e15f612889a2d93625649db',1,'cshift(int __n) const(Global Namespace)']]], + ['csignal_1840',['csignal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00221.html',1,'']]], + ['cstdalign_1841',['cstdalign',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00224.html',1,'']]], + ['cstdarg_1842',['cstdarg',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00227.html',1,'']]], + ['cstdbool_1843',['cstdbool',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00230.html',1,'']]], + ['cstddef_1844',['cstddef',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00233.html',1,'']]], + ['cstdint_1845',['cstdint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00236.html',1,'']]], + ['cstdio_1846',['cstdio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00239.html',1,'']]], + ['cstdlib_1847',['cstdlib',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00242.html',1,'']]], + ['cstring_1848',['cstring',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00245.html',1,'']]], + ['csub_5fmatch_1849',['csub_match',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga29090c6f0fdf0d3241cf79e759838eeb',1,'std::csub_match'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga29090c6f0fdf0d3241cf79e759838eeb',1,'csub_match(Global Namespace)']]], + ['ct_5fassert_5ffailure_1850',['CT_ASSERT_FAILURE',['https://docs.opencv.org/4.2.0/da/d73/structNcvCTprep_1_1CT__ASSERT__FAILURE.html',1,'NcvCTprep']]], + ['ct_5fassert_5ffailure_3c_20true_20_3e_1851',['CT_ASSERT_FAILURE< true >',['https://docs.opencv.org/4.2.0/dc/dcf/structNcvCTprep_1_1CT__ASSERT__FAILURE_3_01true_01_4.html',1,'NcvCTprep']]], + ['ctgmath_1852',['ctgmath',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00248.html',1,'']]], + ['ctime_1853',['ctime',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00251.html',1,'']]], + ['ctrl_1854',['CTRL',['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#aaee8f2a3f0f04415acca5f1ada1ce8edafd3c745ae0bd40c386991c4e3604747c',1,'cv::viz::KeyboardEvent']]], + ['ctype_1855',['ctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html',1,'std::ctype< _CharT >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a283927e767f737e4ef7a7ccd0bec1da1',1,'std::locale::ctype'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#acf81454de90c003b463e19f8703c1cbb',1,'std::ctype< char >::ctype(const mask *__table=0, bool __del=false, size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a00afd225d281cd0a8cd3f35611dd91f9',1,'std::ctype< char >::ctype(__c_locale __cloc, const mask *__table=0, bool __del=false, size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a1151154fd754cfa479a1d4b52a561435',1,'std::ctype< wchar_t >::ctype(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#aea37b8246f8796aa91522d5bcd8c87a3',1,'std::ctype< wchar_t >::ctype(__c_locale __cloc, size_t __refs=0)']]], + ['ctype_3c_20char_20_3e_1856',['ctype< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html',1,'std']]], + ['ctype_3c_20wchar_5ft_20_3e_1857',['ctype< wchar_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html',1,'std']]], + ['ctype_5fbase_1858',['ctype_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08503.html',1,'std']]], + ['ctype_5fbase_2eh_1859',['ctype_base.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00680.html',1,'']]], + ['ctype_5fbyname_1860',['ctype_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05931.html',1,'std']]], + ['ctype_5fbyname_3c_20char_20_3e_1861',['ctype_byname< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05935.html',1,'std']]], + ['ctype_5finline_2eh_1862',['ctype_inline.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00683.html',1,'']]], + ['cube_1863',['cube',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae04fac7e3068f05c3f01982554a21d80',1,'Eigen']]], + ['cuberoot_1864',['cubeRoot',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga51452a9a5b6b232e0d67855c8e27f436',1,'cv::cubeRoot()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga51452a9a5b6b232e0d67855c8e27f436',1,'cubeRoot()(Global Namespace)']]], + ['cubicinterptr_1865',['CubicInterPtr',['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1CubicInterPtr.html',1,'cv::cudev']]], + ['cubicinterptrsz_1866',['CubicInterPtrSz',['https://docs.opencv.org/4.2.0/d2/d00/structcv_1_1cudev_1_1CubicInterPtrSz.html',1,'cv::cudev']]], + ['cuchar_1867',['cuchar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00257.html',1,'']]], + ['cuda_1868',['Building OpenCV for Tegra with CUDA',['https://docs.opencv.org/4.2.0/d6/d15/tutorial_building_tegra_cuda.html',1,'']]], + ['cuda_20accelerated_20computer_20vision_1869',['CUDA-accelerated Computer Vision',['https://docs.opencv.org/4.2.0/d1/d1e/group__cuda.html',1,'']]], + ['cuda_20kernels_1870',['Using Eigen in CUDA kernels',['https://eigen.tuxfamily.org/dox/TopicCUDA.html',1,'']]], + ['cuda_20module_1871',['GPU-Accelerated Computer Vision (cuda module)',['https://docs.opencv.org/4.2.0/da/d2c/tutorial_table_of_content_gpu.html',1,'']]], + ['cuda_20module_20introduction_1872',['CUDA Module Introduction',['https://docs.opencv.org/4.2.0/d2/dbc/cuda_intro.html',1,'']]], + ['cuda_2ehpp_1873',['cuda.hpp',['https://docs.opencv.org/4.2.0/d8/dd1/modules_2core_2include_2opencv2_2core_2cuda_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d7d/modules_2photo_2include_2opencv2_2photo_2cuda_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d44/contrib_2modules_2xfeatures2d_2include_2opencv2_2xfeatures2d_2cuda_8hpp.html',1,'(Global Namespace)']]], + ['cuda_2emarkdown_1874',['cuda.markdown',['https://docs.opencv.org/4.2.0/d5/d00/cuda_8markdown.html',1,'']]], + ['cuda_5fgpu_5fmat_1875',['CUDA_GPU_MAT',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba131b6b2d8f36c9310bf1b2e382e85225',1,'cv::_InputArray']]], + ['cuda_5fhost_5fmem_1876',['CUDA_HOST_MEM',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba7738c968c10d86fc85092882e41e0d77',1,'cv::_InputArray']]], + ['cuda_5fstream_5faccessor_2ehpp_1877',['cuda_stream_accessor.hpp',['https://docs.opencv.org/4.2.0/d3/de8/cuda__stream__accessor_8hpp.html',1,'']]], + ['cuda_5ftypes_2ehpp_1878',['cuda_types.hpp',['https://docs.opencv.org/4.2.0/de/db2/cuda__types_8hpp.html',1,'']]], + ['cudaarithm_2ehpp_1879',['cudaarithm.hpp',['https://docs.opencv.org/4.2.0/d4/d03/cudaarithm_8hpp.html',1,'']]], + ['cudabgsegm_2ehpp_1880',['cudabgsegm.hpp',['https://docs.opencv.org/4.2.0/dc/d3d/cudabgsegm_8hpp.html',1,'']]], + ['cudacodec_2ehpp_1881',['cudacodec.hpp',['https://docs.opencv.org/4.2.0/dd/d4e/cudacodec_8hpp.html',1,'']]], + ['cudafeatures2d_2ehpp_1882',['cudafeatures2d.hpp',['https://docs.opencv.org/4.2.0/d7/d0a/cudafeatures2d_8hpp.html',1,'']]], + ['cudafilters_2ehpp_1883',['cudafilters.hpp',['https://docs.opencv.org/4.2.0/da/dc5/cudafilters_8hpp.html',1,'']]], + ['cudaimgproc_2ehpp_1884',['cudaimgproc.hpp',['https://docs.opencv.org/4.2.0/de/de4/cudaimgproc_8hpp.html',1,'']]], + ['cudalegacy_2ehpp_1885',['cudalegacy.hpp',['https://docs.opencv.org/4.2.0/da/d10/cudalegacy_8hpp.html',1,'']]], + ['cudaobjdetect_2ehpp_1886',['cudaobjdetect.hpp',['https://docs.opencv.org/4.2.0/d2/df3/cudaobjdetect_8hpp.html',1,'']]], + ['cudaoptflow_2ehpp_1887',['cudaoptflow.hpp',['https://docs.opencv.org/4.2.0/d2/d43/cudaoptflow_8hpp.html',1,'']]], + ['cudastereo_2ehpp_1888',['cudastereo.hpp',['https://docs.opencv.org/4.2.0/d8/d60/cudastereo_8hpp.html',1,'']]], + ['cudawarping_2ehpp_1889',['cudawarping.hpp',['https://docs.opencv.org/4.2.0/d1/d3d/cudawarping_8hpp.html',1,'']]], + ['cudev_2ehpp_1890',['cudev.hpp',['https://docs.opencv.org/4.2.0/d6/d38/cudev_8hpp.html',1,'']]], + ['cur_1891',['cur',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'basic_ios< char, _Traits >::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'basic_iostream< char >::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'basic_istream< char >::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'basic_istream< char, _Traits >::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'basic_ostream< char >::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'basic_ostream< char, _Traits >::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_fstream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_ifstream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_ios::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_iostream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_istream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_istringstream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_ofstream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_ostream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_ostringstream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::basic_stringstream::cur'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a1965600e26ca83d186504a4fd337cb9e',1,'std::ios_base::cur']]], + ['curpos_5f_1892',['curPos_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a1aad590502b048b61f749435c44e22ea',1,'cv::videostab::StabilizerBase']]], + ['curr_5fsymbol_1893',['curr_symbol',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a14f1dcb29d715a787f93e43a84b3dbef',1,'std::moneypunct::curr_symbol()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a14f1dcb29d715a787f93e43a84b3dbef',1,'std::moneypunct_byname::curr_symbol()']]], + ['currallocator_1894',['currAllocator',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a7e737c9fe94d01dc12729e2dcea38485',1,'cv::UMatData']]], + ['current_5fexception_1895',['current_exception',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#ga02cdcc517fefe661313437aa9356a28f',1,'std::current_exception()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html#ga02cdcc517fefe661313437aa9356a28f',1,'current_exception()(Global Namespace)']]], + ['currentconfidencemap_1896',['currentConfidenceMap',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a6e7c4c6d8aac7806728d858b3e64d6c3',1,'cv::TrackerModel']]], + ['currentdeviceorientation_1897',['currentDeviceOrientation',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#aa46cf6e9afd8398d35b99cef4f3247f7',1,'CvAbstractCamera']]], + ['curstabilizedpos_5f_1898',['curStabilizedPos_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a0c5cefe4d769bd32a238474101e31ecf',1,'cv::videostab::StabilizerBase']]], + ['custom_1899',['CUSTOM',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56adc68154e13627786e405117dd64012a5',1,'cv::ml::SVM::CUSTOM'],['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1TrackerKCF.html#a2a97c5b832651524b8e782496b933d45a71ad55cb912f219c15e587847c07b0fb',1,'cv::TrackerKCF::CUSTOM']]], + ['custom_20calibration_20pattern_20for_203d_20reconstruction_1900',['Custom Calibration Pattern for 3D reconstruction',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html',1,'']]], + ['custom_20deep_20learning_20layers_20support_1901',['Custom deep learning layers support',['https://docs.opencv.org/4.2.0/dc/db1/tutorial_dnn_custom_layers.html',1,'']]], + ['custom_20scalar_20types_1902',['Using custom scalar types',['https://eigen.tuxfamily.org/dox/TopicCustomizing_CustomScalar.html',1,'']]], + ['customizing_20eigen_1903',['Extending/Customizing Eigen',['https://eigen.tuxfamily.org/dox/UserManual_CustomizingEigen.html',1,'']]], + ['customizing_20the_20cn_20tracker_1904',['Customizing the CN Tracker',['https://docs.opencv.org/4.2.0/dc/db8/tutorial_customizing_cn_tracker.html',1,'']]], + ['custompattern_1905',['CustomPattern',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html',1,'cv::ccalib::CustomPattern'],['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a72a983859063dbab6b82b3f9b3de7fdd',1,'cv::ccalib::CustomPattern::CustomPattern()']]], + ['custompreviewlayer_1906',['customPreviewLayer',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#a46d53b968c51c20e96ef8947444b726d',1,'CvVideoCamera']]], + ['cv_1907',['cv',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html',1,'']]], + ['cv_20application_1908',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], + ['cv16suf_1909',['Cv16suf',['https://docs.opencv.org/4.2.0/dd/d0f/unionCv16suf.html',1,'']]], + ['cv2eigen_1910',['cv2eigen',['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga28d4c291bb74c3b915e2fd62f03906b1',1,'cv::cv2eigen(const Mat &src, Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gaaed24d680285c19716286aa24ae7a579',1,'cv::cv2eigen(const Matx< _Tp, _rows, _cols > &src, Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga5df03dfca2194b7cb59266bcf72f2246',1,'cv::cv2eigen(const Mat &src, Eigen::Matrix< _Tp, Eigen::Dynamic, Eigen::Dynamic > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga3f3a879a3af721ecde8d149dbfc7eeb7',1,'cv::cv2eigen(const Matx< _Tp, _rows, _cols > &src, Eigen::Matrix< _Tp, Eigen::Dynamic, Eigen::Dynamic > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga137921303143b3f17de1307b1feb0860',1,'cv::cv2eigen(const Mat &src, Eigen::Matrix< _Tp, Eigen::Dynamic, 1 > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gaeaf7bbf5b36b766deeaf0c529717ccbb',1,'cv::cv2eigen(const Matx< _Tp, _rows, 1 > &src, Eigen::Matrix< _Tp, Eigen::Dynamic, 1 > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gafd7f2b330fe822f42f918f848ca21dd5',1,'cv::cv2eigen(const Mat &src, Eigen::Matrix< _Tp, 1, Eigen::Dynamic > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gaa57eee0d2918816f75823d9941f1db7b',1,'cv::cv2eigen(const Matx< _Tp, 1, _cols > &src, Eigen::Matrix< _Tp, 1, Eigen::Dynamic > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga28d4c291bb74c3b915e2fd62f03906b1',1,'cv2eigen(const Mat &src, Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gaaed24d680285c19716286aa24ae7a579',1,'cv2eigen(const Matx< _Tp, _rows, _cols > &src, Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga5df03dfca2194b7cb59266bcf72f2246',1,'cv2eigen(const Mat &src, Eigen::Matrix< _Tp, Eigen::Dynamic, Eigen::Dynamic > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga3f3a879a3af721ecde8d149dbfc7eeb7',1,'cv2eigen(const Matx< _Tp, _rows, _cols > &src, Eigen::Matrix< _Tp, Eigen::Dynamic, Eigen::Dynamic > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#ga137921303143b3f17de1307b1feb0860',1,'cv2eigen(const Mat &src, Eigen::Matrix< _Tp, Eigen::Dynamic, 1 > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gaeaf7bbf5b36b766deeaf0c529717ccbb',1,'cv2eigen(const Matx< _Tp, _rows, 1 > &src, Eigen::Matrix< _Tp, Eigen::Dynamic, 1 > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gafd7f2b330fe822f42f918f848ca21dd5',1,'cv2eigen(const Mat &src, Eigen::Matrix< _Tp, 1, Eigen::Dynamic > &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gaa57eee0d2918816f75823d9941f1db7b',1,'cv2eigen(const Matx< _Tp, 1, _cols > &src, Eigen::Matrix< _Tp, 1, Eigen::Dynamic > &dst)(Global Namespace)']]], + ['cv32suf_1911',['Cv32suf',['https://docs.opencv.org/4.2.0/d9/df3/unionCv32suf.html',1,'']]], + ['cv64suf_1912',['Cv64suf',['https://docs.opencv.org/4.2.0/de/d55/unionCv64suf.html',1,'']]], + ['cv_3a_3aaruco_1913',['aruco',['https://docs.opencv.org/4.2.0/d4/d17/namespacecv_1_1aruco.html',1,'cv']]], + ['cv_3a_3abgsegm_1914',['bgsegm',['https://docs.opencv.org/4.2.0/df/d5d/namespacecv_1_1bgsegm.html',1,'cv']]], + ['cv_3a_3abioinspired_1915',['bioinspired',['https://docs.opencv.org/4.2.0/d2/d81/namespacecv_1_1bioinspired.html',1,'cv']]], + ['cv_3a_3abioinspired_3a_3aretinaparameters_1916',['RetinaParameters',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html',1,'cv::bioinspired']]], + ['cv_3a_3accalib_1917',['ccalib',['https://docs.opencv.org/4.2.0/d7/d94/namespacecv_1_1ccalib.html',1,'cv']]], + ['cv_3a_3acnn_5f3dobj_1918',['cnn_3dobj',['https://docs.opencv.org/4.2.0/d9/d57/namespacecv_1_1cnn__3dobj.html',1,'cv']]], + ['cv_3a_3acuda_1919',['cuda',['https://docs.opencv.org/4.2.0/d1/d1a/namespacecv_1_1cuda.html',1,'cv']]], + ['cv_3a_3acuda_3a_3agpumat_1920',['GpuMat',['https://docs.opencv.org/4.2.0/df/d98/classcv_1_1cuda_1_1GpuMat_1_1Allocator.html',1,'cv::cuda']]], + ['cv_3a_3acuda_3a_3agpumat_20with_20thrust_1921',['Using a cv::cuda::GpuMat with thrust',['https://docs.opencv.org/4.2.0/d8/db9/tutorial_gpu_thrust_interop.html',1,'']]], + ['cv_3a_3acudacodec_1922',['cudacodec',['https://docs.opencv.org/4.2.0/d0/de6/namespacecv_1_1cudacodec.html',1,'cv']]], + ['cv_3a_3acudev_1923',['cudev',['https://docs.opencv.org/4.2.0/df/d1d/namespacecv_1_1cudev.html',1,'cv']]], + ['cv_3a_3acudev_3a_3acolor_5fcvt_5fdetail_1924',['color_cvt_detail',['https://docs.opencv.org/4.2.0/df/d47/classcv_1_1cudev_1_1color__cvt__detail_1_1Gray2RGB.html',1,'cv::cudev']]], + ['cv_3a_3acudev_3a_3afunctional_5fdetail_1925',['functional_detail',['https://docs.opencv.org/4.2.0/d8/db9/namespacecv_1_1cudev_1_1functional__detail.html',1,'cv::cudev']]], + ['cv_3a_3acudev_3a_3asum_1926',['Sum',['https://docs.opencv.org/4.2.0/d1/d1d/structcv_1_1cudev_1_1Sum_1_1rebind.html',1,'cv::cudev']]], + ['cv_3a_3acudev_3a_3avec_5fmath_5fdetail_1927',['vec_math_detail',['https://docs.opencv.org/4.2.0/d8/d80/namespacecv_1_1cudev_1_1vec__math__detail.html',1,'cv::cudev']]], + ['cv_3a_3adatasets_1928',['datasets',['https://docs.opencv.org/4.2.0/d0/d44/namespacecv_1_1datasets.html',1,'cv']]], + ['cv_3a_3adescriptormatcher_1929',['DescriptorMatcher',['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html',1,'cv']]], + ['cv_3a_3adetail_1930',['detail',['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html',1,'cv']]], + ['cv_3a_3adetail_3a_3ahas_5fcustom_5fwrap_1931',['has_custom_wrap',['https://docs.opencv.org/4.2.0/dd/d16/classcv_1_1detail_1_1has__custom__wrap_1_1check.html',1,'cv::detail']]], + ['cv_3a_3adetail_3a_3aoclcallhelper_1932',['OCLCallHelper',['https://docs.opencv.org/4.2.0/d5/def/structcv_1_1detail_1_1OCLCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_1tua67cc2fc13da93c8cd58afcdf4d9cddf.html',1,'cv::detail']]], + ['cv_3a_3adetail_3a_3aocvcallhelper_1933',['OCVCallHelper',['https://docs.opencv.org/4.2.0/df/de6/structcv_1_1detail_1_1OCVCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_1tu8bfb77c34485398698447f60ee067830.html',1,'cv::detail']]], + ['cv_3a_3adetails_1934',['details',['https://docs.opencv.org/4.2.0/d9/d9e/namespacecv_1_1details.html',1,'cv']]], + ['cv_3a_3adetails_3a_3atlsstorage_1935',['TlsStorage',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#aa3eac24e60c6a2312e113759cb3ed391',1,'cv::TLSDataContainer']]], + ['cv_3a_3adirectx_1936',['directx',['https://docs.opencv.org/4.2.0/d9/d12/namespacecv_1_1directx.html',1,'cv']]], + ['cv_3a_3adirectx_3a_3aocl_1937',['ocl',['https://docs.opencv.org/4.2.0/dd/d58/namespacecv_1_1directx_1_1ocl.html',1,'cv::directx']]], + ['cv_3a_3adnn_1938',['dnn',['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html',1,'cv']]], + ['cv_3a_3adnn_3a_3adetails_1939',['details',['https://docs.opencv.org/4.2.0/de/db0/namespacecv_1_1dnn_1_1details.html',1,'cv::dnn']]], + ['cv_3a_3adnn_5fobjdetect_1940',['dnn_objdetect',['https://docs.opencv.org/4.2.0/d9/d16/namespacecv_1_1dnn__objdetect.html',1,'cv']]], + ['cv_3a_3adnn_5fsuperres_1941',['dnn_superres',['https://docs.opencv.org/4.2.0/de/d9a/namespacecv_1_1dnn__superres.html',1,'cv']]], + ['cv_3a_3adpm_1942',['dpm',['https://docs.opencv.org/4.2.0/d5/d43/namespacecv_1_1dpm.html',1,'cv']]], + ['cv_3a_3adynafu_1943',['dynafu',['https://docs.opencv.org/4.2.0/d4/d41/namespacecv_1_1dynafu.html',1,'cv']]], + ['cv_3a_3aerror_1944',['Error',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html',1,'cv']]], + ['cv_3a_3aface_1945',['face',['https://docs.opencv.org/4.2.0/d4/d48/namespacecv_1_1face.html',1,'cv']]], + ['cv_3a_3aface_3a_3afacemarkaam_1946',['FacemarkAAM',['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html',1,'cv::face']]], + ['cv_3a_3aface_3a_3afacemarklbf_1947',['FacemarkLBF',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1face_1_1FacemarkLBF_1_1BBox.html',1,'cv::face']]], + ['cv_3a_3aface_3a_3astandardcollector_1948',['StandardCollector',['https://docs.opencv.org/4.2.0/d2/d5a/structcv_1_1face_1_1StandardCollector_1_1PredictResult.html',1,'cv::face']]], + ['cv_3a_3afisheye_1949',['fisheye',['https://docs.opencv.org/4.2.0/d2/d14/namespacecv_1_1fisheye.html',1,'cv']]], + ['cv_3a_3aflann_1950',['flann',['https://docs.opencv.org/4.2.0/d0/d0a/namespacecv_1_1flann.html',1,'cv']]], + ['cv_3a_3afreetype_1951',['freetype',['https://docs.opencv.org/4.2.0/db/d33/namespacecv_1_1freetype.html',1,'cv']]], + ['cv_3a_3aft_1952',['ft',['https://docs.opencv.org/4.2.0/df/d47/namespacecv_1_1ft.html',1,'cv']]], + ['cv_3a_3agapi_1953',['gapi',['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html',1,'cv']]], + ['cv_3a_3agapi_3a_3acompound_1954',['compound',['https://docs.opencv.org/4.2.0/d8/d5c/namespacecv_1_1gapi_1_1compound.html',1,'cv::gapi']]], + ['cv_3a_3agapi_3a_3acore_1955',['core',['https://docs.opencv.org/4.2.0/d9/d90/namespacecv_1_1gapi_1_1core.html',1,'cv::gapi']]], + ['cv_3a_3agapi_3a_3acore_3a_3acpu_1956',['cpu',['https://docs.opencv.org/4.2.0/d6/dd0/namespacecv_1_1gapi_1_1core_1_1cpu.html',1,'cv::gapi::core']]], + ['cv_3a_3agapi_3a_3acore_3a_3afluid_1957',['fluid',['https://docs.opencv.org/4.2.0/db/db6/namespacecv_1_1gapi_1_1core_1_1fluid.html',1,'cv::gapi::core']]], + ['cv_3a_3agapi_3a_3acore_3a_3agpu_1958',['gpu',['https://docs.opencv.org/4.2.0/db/d86/namespacecv_1_1gapi_1_1core_1_1gpu.html',1,'cv::gapi::core']]], + ['cv_3a_3agapi_3a_3acore_3a_3aocl_1959',['ocl',['https://docs.opencv.org/4.2.0/d6/d68/namespacecv_1_1gapi_1_1core_1_1ocl.html',1,'cv::gapi::core']]], + ['cv_3a_3agapi_3a_3acore_3a_3aplaidml_1960',['plaidml',['https://docs.opencv.org/4.2.0/d1/d49/namespacecv_1_1gapi_1_1core_1_1plaidml.html',1,'cv::gapi::core']]], + ['cv_3a_3agapi_3a_3acpu_1961',['cpu',['https://docs.opencv.org/4.2.0/d0/d83/namespacecv_1_1gapi_1_1cpu.html',1,'cv::gapi']]], + ['cv_3a_3agapi_3a_3afluid_1962',['fluid',['https://docs.opencv.org/4.2.0/d0/d1a/namespacecv_1_1gapi_1_1fluid.html',1,'cv::gapi']]], + ['cv_3a_3agapi_3a_3afluid_3a_3aview_1963',['View',['https://docs.opencv.org/4.2.0/da/da5/structcv_1_1gapi_1_1fluid_1_1View_1_1Cache.html',1,'cv::gapi::fluid']]], + ['cv_3a_3agapi_3a_3aie_1964',['ie',['https://docs.opencv.org/4.2.0/d1/dae/namespacecv_1_1gapi_1_1ie.html',1,'cv::gapi']]], + ['cv_3a_3agapi_3a_3aie_3a_3adetail_1965',['detail',['https://docs.opencv.org/4.2.0/d5/dfc/namespacecv_1_1gapi_1_1ie_1_1detail.html',1,'cv::gapi::ie']]], + ['cv_3a_3agapi_3a_3aimgproc_1966',['imgproc',['https://docs.opencv.org/4.2.0/de/df8/namespacecv_1_1gapi_1_1imgproc.html',1,'cv::gapi']]], + ['cv_3a_3agapi_3a_3aimgproc_3a_3acpu_1967',['cpu',['https://docs.opencv.org/4.2.0/d3/dde/namespacecv_1_1gapi_1_1imgproc_1_1cpu.html',1,'cv::gapi::imgproc']]], + ['cv_3a_3agapi_3a_3aimgproc_3a_3afluid_1968',['fluid',['https://docs.opencv.org/4.2.0/d3/def/namespacecv_1_1gapi_1_1imgproc_1_1fluid.html',1,'cv::gapi::imgproc']]], + ['cv_3a_3agapi_3a_3aimgproc_3a_3agpu_1969',['gpu',['https://docs.opencv.org/4.2.0/df/d89/namespacecv_1_1gapi_1_1imgproc_1_1gpu.html',1,'cv::gapi::imgproc']]], + ['cv_3a_3agapi_3a_3aimgproc_3a_3aocl_1970',['ocl',['https://docs.opencv.org/4.2.0/dc/d7a/namespacecv_1_1gapi_1_1imgproc_1_1ocl.html',1,'cv::gapi::imgproc']]], + ['cv_3a_3agapi_3a_3aocl_1971',['ocl',['https://docs.opencv.org/4.2.0/d8/dc9/namespacecv_1_1gapi_1_1ocl.html',1,'cv::gapi']]], + ['cv_3a_3agapi_3a_3aown_1972',['own',['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html',1,'cv::gapi']]], + ['cv_3a_3agapi_3a_3aown_3a_3adetail_1973',['detail',['https://docs.opencv.org/4.2.0/d0/d06/namespacecv_1_1gapi_1_1own_1_1detail.html',1,'cv::gapi::own']]], + ['cv_3a_3agapi_3a_3aplaidml_1974',['plaidml',['https://docs.opencv.org/4.2.0/d6/dbb/namespacecv_1_1gapi_1_1plaidml.html',1,'cv::gapi']]], + ['cv_3a_3agapi_3a_3arender_1975',['render',['https://docs.opencv.org/4.2.0/db/df4/namespacecv_1_1gapi_1_1render.html',1,'cv::gapi']]], + ['cv_3a_3agapi_3a_3arender_3a_3aocv_1976',['ocv',['https://docs.opencv.org/4.2.0/da/d40/namespacecv_1_1gapi_1_1render_1_1ocv.html',1,'cv::gapi::render']]], + ['cv_3a_3agapi_3a_3awip_1977',['wip',['https://docs.opencv.org/4.2.0/dd/de9/namespacecv_1_1gapi_1_1wip.html',1,'cv::gapi']]], + ['cv_3a_3agapi_3a_3awip_3a_3adraw_1978',['draw',['https://docs.opencv.org/4.2.0/df/d8d/namespacecv_1_1gapi_1_1wip_1_1draw.html',1,'cv::gapi::wip']]], + ['cv_3a_3agarray_1979',['GArray',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#a91e30185633cddc373a780afeb845c78',1,'cv::detail::GArrayU']]], + ['cv_3a_3agcomputationt_1980',['GComputationT',['https://docs.opencv.org/4.2.0/dd/d7b/classcv_1_1GComputationT_3_01R_07Args_8_8_8_08_4_1_1GCompiledT.html',1,'cv']]], + ['cv_3a_3agimpl_1981',['gimpl',['https://docs.opencv.org/4.2.0/d9/d43/namespacecv_1_1gimpl.html',1,'cv']]], + ['cv_3a_3agimpl_3a_3arender_1982',['render',['https://docs.opencv.org/4.2.0/d6/dc2/namespacecv_1_1gimpl_1_1render.html',1,'cv::gimpl']]], + ['cv_3a_3agimpl_3a_3arender_3a_3aocv_1983',['ocv',['https://docs.opencv.org/4.2.0/d8/d57/namespacecv_1_1gimpl_1_1render_1_1ocv.html',1,'cv::gimpl::render']]], + ['cv_3a_3ahal_1984',['hal',['https://docs.opencv.org/4.2.0/d6/d19/namespacecv_1_1hal.html',1,'cv']]], + ['cv_3a_3ahdf_1985',['hdf',['https://docs.opencv.org/4.2.0/dd/d44/namespacecv_1_1hdf.html',1,'cv']]], + ['cv_3a_3ahfs_1986',['hfs',['https://docs.opencv.org/4.2.0/d9/de8/namespacecv_1_1hfs.html',1,'cv']]], + ['cv_3a_3aimg_5fhash_1987',['img_hash',['https://docs.opencv.org/4.2.0/de/d85/namespacecv_1_1img__hash.html',1,'cv']]], + ['cv_3a_3ainstr_1988',['instr',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html',1,'cv']]], + ['cv_3a_3ainternal_1989',['internal',['https://docs.opencv.org/4.2.0/d4/d88/namespacecv_1_1internal.html',1,'cv']]], + ['cv_3a_3akinfu_1990',['kinfu',['https://docs.opencv.org/4.2.0/d9/dfc/namespacecv_1_1kinfu.html',1,'cv']]], + ['cv_3a_3aline_5fdescriptor_1991',['line_descriptor',['https://docs.opencv.org/4.2.0/d2/d51/namespacecv_1_1line__descriptor.html',1,'cv']]], + ['cv_3a_3alinemod_1992',['linemod',['https://docs.opencv.org/4.2.0/d5/d08/namespacecv_1_1linemod.html',1,'cv']]], + ['cv_3a_3alinemod_3a_3aquantizedpyramid_1993',['QuantizedPyramid',['https://docs.opencv.org/4.2.0/df/da3/structcv_1_1linemod_1_1QuantizedPyramid_1_1Candidate.html',1,'cv::linemod']]], + ['cv_3a_3almsolver_1994',['LMSolver',['https://docs.opencv.org/4.2.0/d8/d9f/classcv_1_1LMSolver_1_1Callback.html',1,'cv']]], + ['cv_3a_3aminproblemsolver_1995',['MinProblemSolver',['https://docs.opencv.org/4.2.0/da/d62/classcv_1_1MinProblemSolver_1_1Function.html',1,'cv']]], + ['cv_3a_3aml_1996',['ml',['https://docs.opencv.org/4.2.0/d8/df1/namespacecv_1_1ml.html',1,'cv']]], + ['cv_3a_3aml_3a_3asvm_1997',['SVM',['https://docs.opencv.org/4.2.0/d7/db8/classcv_1_1ml_1_1SVM_1_1Kernel.html',1,'cv::ml']]], + ['cv_3a_3amotempl_1998',['motempl',['https://docs.opencv.org/4.2.0/da/d2c/namespacecv_1_1motempl.html',1,'cv']]], + ['cv_3a_3amulticalib_1999',['multicalib',['https://docs.opencv.org/4.2.0/d8/db8/namespacecv_1_1multicalib.html',1,'cv']]], + ['cv_3a_3amulticalib_3a_3amulticameracalibration_2000',['MultiCameraCalibration',['https://docs.opencv.org/4.2.0/df/db0/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1edge.html',1,'cv::multicalib']]], + ['cv_3a_3aocl_2001',['ocl',['https://docs.opencv.org/4.2.0/d5/d96/namespacecv_1_1ocl.html',1,'cv']]], + ['cv_3a_3aogl_2002',['ogl',['https://docs.opencv.org/4.2.0/df/d60/namespacecv_1_1ogl.html',1,'cv']]], + ['cv_3a_3aogl_3a_3aocl_2003',['ocl',['https://docs.opencv.org/4.2.0/d1/d36/namespacecv_1_1ogl_1_1ocl.html',1,'cv::ogl']]], + ['cv_3a_3aomnidir_2004',['omnidir',['https://docs.opencv.org/4.2.0/db/dd2/namespacecv_1_1omnidir.html',1,'cv']]], + ['cv_3a_3aomnidir_3a_3ainternal_2005',['internal',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html',1,'cv::omnidir']]], + ['cv_3a_3aoptflow_2006',['optflow',['https://docs.opencv.org/4.2.0/d7/df9/namespacecv_1_1optflow.html',1,'cv']]], + ['cv_3a_3aovis_2007',['ovis',['https://docs.opencv.org/4.2.0/dc/d06/namespacecv_1_1ovis.html',1,'cv']]], + ['cv_3a_3aphase_5funwrapping_2008',['phase_unwrapping',['https://docs.opencv.org/4.2.0/dd/dea/namespacecv_1_1phase__unwrapping.html',1,'cv']]], + ['cv_3a_3aplot_2009',['plot',['https://docs.opencv.org/4.2.0/d0/d62/namespacecv_1_1plot.html',1,'cv']]], + ['cv_3a_3appf_5fmatch_5f3d_2010',['ppf_match_3d',['https://docs.opencv.org/4.2.0/d0/de6/namespacecv_1_1ppf__match__3d.html',1,'cv']]], + ['cv_3a_3aquality_2011',['quality',['https://docs.opencv.org/4.2.0/da/d0b/namespacecv_1_1quality.html',1,'cv']]], + ['cv_3a_3aquality_3a_3aquality_5futils_2012',['quality_utils',['https://docs.opencv.org/4.2.0/d6/d84/namespacecv_1_1quality_1_1quality__utils.html',1,'cv::quality']]], + ['cv_3a_3aquality_3a_3aqualitygmsd_2013',['QualityGMSD',['https://docs.opencv.org/4.2.0/d2/d60/structcv_1_1quality_1_1QualityGMSD_1_1__mat__data.html',1,'cv::quality']]], + ['cv_3a_3aquality_3a_3aqualityssim_2014',['QualitySSIM',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html',1,'cv::quality']]], + ['cv_3a_3arandpattern_2015',['randpattern',['https://docs.opencv.org/4.2.0/db/d7d/namespacecv_1_1randpattern.html',1,'cv']]], + ['cv_3a_3areg_2016',['reg',['https://docs.opencv.org/4.2.0/dd/d9a/namespacecv_1_1reg.html',1,'cv']]], + ['cv_3a_3argbd_2017',['rgbd',['https://docs.opencv.org/4.2.0/d7/d0b/namespacecv_1_1rgbd.html',1,'cv']]], + ['cv_3a_3asaliency_2018',['saliency',['https://docs.opencv.org/4.2.0/dc/d0d/namespacecv_1_1saliency.html',1,'cv']]], + ['cv_3a_3asamples_2019',['samples',['https://docs.opencv.org/4.2.0/df/df3/namespacecv_1_1samples.html',1,'cv']]], + ['cv_3a_3asfm_2020',['sfm',['https://docs.opencv.org/4.2.0/db/db0/namespacecv_1_1sfm.html',1,'cv']]], + ['cv_3a_3asimpleblobdetector_2021',['SimpleBlobDetector',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html',1,'cv']]], + ['cv_3a_3asparsemat_2022',['SparseMat',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html',1,'cv']]], + ['cv_3a_3astereo_2023',['stereo',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html',1,'cv']]], + ['cv_3a_3astructured_5flight_2024',['structured_light',['https://docs.opencv.org/4.2.0/d7/d58/namespacecv_1_1structured__light.html',1,'cv']]], + ['cv_3a_3astructured_5flight_3a_3asinusoidalpattern_2025',['SinusoidalPattern',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html',1,'cv::structured_light']]], + ['cv_3a_3asubdiv2d_2026',['Subdiv2D',['https://docs.opencv.org/4.2.0/d4/dbc/structcv_1_1Subdiv2D_1_1QuadEdge.html',1,'cv']]], + ['cv_3a_3asuperres_2027',['superres',['https://docs.opencv.org/4.2.0/d8/d85/namespacecv_1_1superres.html',1,'cv']]], + ['cv_3a_3atbm_2028',['tbm',['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html',1,'cv']]], + ['cv_3a_3atext_2029',['text',['https://docs.opencv.org/4.2.0/d8/de7/namespacecv_1_1text.html',1,'cv']]], + ['cv_3a_3atext_3a_3aerfilter_2030',['ERFilter',['https://docs.opencv.org/4.2.0/d0/d4f/classcv_1_1text_1_1ERFilter_1_1Callback.html',1,'cv::text']]], + ['cv_3a_3atext_3a_3aocrbeamsearchdecoder_2031',['OCRBeamSearchDecoder',['https://docs.opencv.org/4.2.0/de/d2d/classcv_1_1text_1_1OCRBeamSearchDecoder_1_1ClassifierCallback.html',1,'cv::text']]], + ['cv_3a_3atext_3a_3aocrhmmdecoder_2032',['OCRHMMDecoder',['https://docs.opencv.org/4.2.0/db/dc0/classcv_1_1text_1_1OCRHMMDecoder_1_1ClassifierCallback.html',1,'cv::text']]], + ['cv_3a_3atld_2033',['tld',['https://docs.opencv.org/4.2.0/db/d13/namespacecv_1_1tld.html',1,'cv']]], + ['cv_3a_3atrackerboosting_2034',['TrackerBoosting',['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html',1,'cv']]], + ['cv_3a_3atrackercsrt_2035',['TrackerCSRT',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html',1,'cv']]], + ['cv_3a_3atrackerfeaturehaar_2036',['TrackerFeatureHAAR',['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html',1,'cv']]], + ['cv_3a_3atrackergoturn_2037',['TrackerGOTURN',['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1TrackerGOTURN_1_1Params.html',1,'cv']]], + ['cv_3a_3atrackerkcf_2038',['TrackerKCF',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html',1,'cv']]], + ['cv_3a_3atrackermedianflow_2039',['TrackerMedianFlow',['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html',1,'cv']]], + ['cv_3a_3atrackermil_2040',['TrackerMIL',['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html',1,'cv']]], + ['cv_3a_3atrackersamplercs_2041',['TrackerSamplerCS',['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html',1,'cv']]], + ['cv_3a_3atrackersamplercsc_2042',['TrackerSamplerCSC',['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html',1,'cv']]], + ['cv_3a_3atrackersamplerpf_2043',['TrackerSamplerPF',['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html',1,'cv']]], + ['cv_3a_3atrackerstateestimatoradaboosting_2044',['TrackerStateEstimatorAdaBoosting',['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html',1,'cv']]], + ['cv_3a_3atrackerstateestimatormilboosting_2045',['TrackerStateEstimatorMILBoosting',['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html',1,'cv']]], + ['cv_3a_3atrackertld_2046',['TrackerTLD',['https://docs.opencv.org/4.2.0/d3/dd0/structcv_1_1TrackerTLD_1_1Params.html',1,'cv']]], + ['cv_3a_3atracking_2047',['tracking',['https://docs.opencv.org/4.2.0/da/dd0/namespacecv_1_1tracking.html',1,'cv']]], + ['cv_3a_3atraits_2048',['traits',['https://docs.opencv.org/4.2.0/d7/db8/namespacecv_1_1traits.html',1,'cv']]], + ['cv_3a_3autil_2049',['util',['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html',1,'cv']]], + ['cv_3a_3autil_3a_3adetail_2050',['detail',['https://docs.opencv.org/4.2.0/d9/dab/namespacecv_1_1util_1_1detail.html',1,'cv::util']]], + ['cv_3a_3autils_2051',['utils',['https://docs.opencv.org/4.2.0/d3/dc4/namespacecv_1_1utils.html',1,'cv']]], + ['cv_3a_3autils_3a_3afs_2052',['fs',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html',1,'cv::utils']]], + ['cv_3a_3autils_3a_3alogging_2053',['logging',['https://docs.opencv.org/4.2.0/da/db0/namespacecv_1_1utils_1_1logging.html',1,'cv::utils']]], + ['cv_3a_3autils_3a_3alogging_3a_3ainternal_2054',['internal',['https://docs.opencv.org/4.2.0/d9/dd4/namespacecv_1_1utils_1_1logging_1_1internal.html',1,'cv::utils::logging']]], + ['cv_3a_3autils_3a_3atrace_2055',['trace',['https://docs.opencv.org/4.2.0/d1/d07/namespacecv_1_1utils_1_1trace.html',1,'cv::utils']]], + ['cv_3a_3ava_5fintel_2056',['va_intel',['https://docs.opencv.org/4.2.0/d9/d83/namespacecv_1_1va__intel.html',1,'cv']]], + ['cv_3a_3ava_5fintel_3a_3aocl_2057',['ocl',['https://docs.opencv.org/4.2.0/df/df8/namespacecv_1_1va__intel_1_1ocl.html',1,'cv::va_intel']]], + ['cv_3a_3avideoio_5fregistry_2058',['videoio_registry',['https://docs.opencv.org/4.2.0/de/dde/namespacecv_1_1videoio__registry.html',1,'cv']]], + ['cv_3a_3avideostab_2059',['videostab',['https://docs.opencv.org/4.2.0/da/d6d/namespacecv_1_1videostab.html',1,'cv']]], + ['cv_3a_3aviz_2060',['viz',['https://docs.opencv.org/4.2.0/d9/d62/namespacecv_1_1viz.html',1,'cv']]], + ['cv_3a_3axfeatures2d_2061',['xfeatures2d',['https://docs.opencv.org/4.2.0/d3/df6/namespacecv_1_1xfeatures2d.html',1,'cv']]], + ['cv_3a_3aximgproc_2062',['ximgproc',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html',1,'cv']]], + ['cv_3a_3aximgproc_3a_3arl_2063',['rl',['https://docs.opencv.org/4.2.0/d2/d1a/namespacecv_1_1ximgproc_1_1rl.html',1,'cv::ximgproc']]], + ['cv_3a_3aximgproc_3a_3asegmentation_2064',['segmentation',['https://docs.opencv.org/4.2.0/d8/d8a/namespacecv_1_1ximgproc_1_1segmentation.html',1,'cv::ximgproc']]], + ['cv_3a_3axobjdetect_2065',['xobjdetect',['https://docs.opencv.org/4.2.0/d3/d30/namespacecv_1_1xobjdetect.html',1,'cv']]], + ['cv_3a_3axphoto_2066',['xphoto',['https://docs.opencv.org/4.2.0/df/db9/namespacecv_1_1xphoto.html',1,'cv']]], + ['cv_5fabs_2067',['cv_abs',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gab3fbec499b8b9ec34ebbc038aa0df479',1,'cv::cv_abs(_Tp x)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga7ff9da9e1d83d45c8778435633074fd7',1,'cv::cv_abs(uchar x)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga39fbc1a33aedb130e3c0e59e8c2f64ec',1,'cv::cv_abs(schar x)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga276f90264ac8083f22d139520f62c44f',1,'cv::cv_abs(ushort x)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga4f5a784b6921093228ec0ffd3b464fa5',1,'cv::cv_abs(short x)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gab3fbec499b8b9ec34ebbc038aa0df479',1,'cv_abs(_Tp x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga7ff9da9e1d83d45c8778435633074fd7',1,'cv_abs(uchar x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga39fbc1a33aedb130e3c0e59e8c2f64ec',1,'cv_abs(schar x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga276f90264ac8083f22d139520f62c44f',1,'cv_abs(ushort x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga4f5a784b6921093228ec0ffd3b464fa5',1,'cv_abs(short x)(Global Namespace)']]], + ['cv_5fcpu_5fdispatch_2eh_2068',['cv_cpu_dispatch.h',['https://docs.opencv.org/4.2.0/d1/dac/cv__cpu__dispatch_8h.html',1,'']]], + ['cv_5fcpu_5fhelper_2eh_2069',['cv_cpu_helper.h',['https://docs.opencv.org/4.2.0/d2/d3b/cv__cpu__helper_8h.html',1,'']]], + ['cv_5fcpu_5finclude_5fsimd_5fdeclarations_2ehpp_2070',['cv_cpu_include_simd_declarations.hpp',['https://docs.opencv.org/4.2.0/d2/d7c/cv__cpu__include__simd__declarations_8hpp.html',1,'']]], + ['cv_5fcs_5fcensus_2071',['CV_CS_CENSUS',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030aac1c7a2d4ad6f2a23a39bf8b760c00a7',1,'cv::stereo']]], + ['cv_5fdense_5fcensus_2072',['CV_DENSE_CENSUS',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030afd8fa32e4653c225c061fb2326b2eba0',1,'cv::stereo']]], + ['cv_5ferror_5ffail_2073',['CV_ERROR_FAIL',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html#gga3fa591dc2d89e8e6b84a2a7202e53367ac34ec3b7a47b8f639326d44d5074c6ef',1,]]], + ['cv_5ferror_5fok_2074',['CV_ERROR_OK',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html#gga3fa591dc2d89e8e6b84a2a7202e53367abf35bd19393375fdeeef47ae6cfde0f8',1,]]], + ['cv_5fmean_5fvariation_2075',['CV_MEAN_VARIATION',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030a0103fea918b22dd6e8882c5b06043d7e',1,'cv::stereo']]], + ['cv_5fmodified_5fcensus_5ftransform_2076',['CV_MODIFIED_CENSUS_TRANSFORM',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030a1bde9860c3201024e7b68e5dc71931c5',1,'cv::stereo']]], + ['cv_5fmodified_5fcs_5fcensus_2077',['CV_MODIFIED_CS_CENSUS',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030aa217c4ece909e8d27bdcb50a12d81f6d',1,'cv::stereo']]], + ['cv_5fquadratic_5finterpolation_2078',['CV_QUADRATIC_INTERPOLATION',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gga0316af1df7908b2fb741f282dcb2ae74a9b1155a0c2c6722aa9e41c4c4d4c0a58',1,'cv::stereo::CV_QUADRATIC_INTERPOLATION'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gga0316af1df7908b2fb741f282dcb2ae74a9b1155a0c2c6722aa9e41c4c4d4c0a58',1,'CV_QUADRATIC_INTERPOLATION(Global Namespace)']]], + ['cv_5fsimetricv_5finterpolation_2079',['CV_SIMETRICV_INTERPOLATION',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gga0316af1df7908b2fb741f282dcb2ae74a44f645f3eb948edfd55a5c9bb73dbd82',1,'cv::stereo::CV_SIMETRICV_INTERPOLATION'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gga0316af1df7908b2fb741f282dcb2ae74a44f645f3eb948edfd55a5c9bb73dbd82',1,'CV_SIMETRICV_INTERPOLATION(Global Namespace)']]], + ['cv_5fsparse_5fcensus_2080',['CV_SPARSE_CENSUS',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030ac08eff59ba7cfc0aa727e62530b32223',1,'cv::stereo']]], + ['cv_5fspeckle_5fremoval_5falgorithm_2081',['CV_SPECKLE_REMOVAL_ALGORITHM',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ggae93f4ada32b12123aeed26cb01094638ad3a671c26e45b96aca07a4562d9b9db7',1,'cv::stereo::CV_SPECKLE_REMOVAL_ALGORITHM'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ggae93f4ada32b12123aeed26cb01094638ad3a671c26e45b96aca07a4562d9b9db7',1,'CV_SPECKLE_REMOVAL_ALGORITHM(Global Namespace)']]], + ['cv_5fspeckle_5fremoval_5favg_5falgorithm_2082',['CV_SPECKLE_REMOVAL_AVG_ALGORITHM',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ggae93f4ada32b12123aeed26cb01094638ad2b1bbe8c716a18472feab8784695f5d',1,'cv::stereo::CV_SPECKLE_REMOVAL_AVG_ALGORITHM'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ggae93f4ada32b12123aeed26cb01094638ad2b1bbe8c716a18472feab8784695f5d',1,'CV_SPECKLE_REMOVAL_AVG_ALGORITHM(Global Namespace)']]], + ['cv_5fstar_5fkernel_2083',['CV_STAR_KERNEL',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6c80b7fb1fd1bd764cd91fe2ba8db030af1709c357cf1ba90ad602dde3cab283f',1,'cv::stereo']]], + ['cv_5fstatus_2084',['cv_status',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html#gad3ce465ffb10e354aa30c4ce93b68bee',1,'std::cv_status'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html#gad3ce465ffb10e354aa30c4ce93b68bee',1,'cv_status(Global Namespace)']]], + ['cv_5funused_2085',['CV_UNUSED',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#abfb11f5348247bc930a7ffb953efd166',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#ac6894b0fbbc7cbae1e389b33ff0dbf5a',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#ab1dc3eb6286fb5d7874773b6a36cbf89',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#aa48d9c37039275f85a9bcecfc4601e6f',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a364cccdc091b79979398213a1faef497',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#aa2bcefca61d98059885b95473b631112',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a4b84f8dd9fea5a8080efc43f1d623b12',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a793ec34ffabea9a55d7136a6110589dd',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a2edc3d0452446a9264ce5d2389bbaeff',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a6d17c677ce74defaf3de65fe021f7cbd',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a670bce50efd81aa557ddcde80d71dbb1',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#ab13211abaaa4aaab2fcbd584d4be9fc6',1,'CvAbstractCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/d4/d1d/interfaceCvPhotoCamera.html#a88ca069176e27ed45ed33738a0316477',1,'CvPhotoCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#aba3829a775c6f93feae0f589fa1f948c',1,'CvVideoCamera::CV_UNUSED()'],['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#aa7f4cb9d0289b6973e0666fd038cade2',1,'CvVideoCamera::CV_UNUSED()']]], + ['cv_5fvrecp_5ff32_2086',['cv_vrecp_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#gaeb314eb0f269a9769453517e931e3963',1,]]], + ['cv_5fvrecpq_5ff32_2087',['cv_vrecpq_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#ga2c5d24998fb8d4d09587ae59276ccc7b',1,]]], + ['cv_5fvrnd_5fs32_5ff32_2088',['cv_vrnd_s32_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#ga8a5239a569a5981ebde879d4733880a7',1,]]], + ['cv_5fvrnd_5fu32_5ff32_2089',['cv_vrnd_u32_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#gafdc59151bc3772ea9ba541aac20c9475',1,]]], + ['cv_5fvrndq_5fs32_5ff32_2090',['cv_vrndq_s32_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#ga048ba8911b40c0a93c66b181d93ffd21',1,]]], + ['cv_5fvrndq_5fu32_5ff32_2091',['cv_vrndq_u32_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#gad1de174f2f34485c51599e29a6c6ffa2',1,]]], + ['cv_5fvrsqrt_5ff32_2092',['cv_vrsqrt_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#ga9630868e44d91def9c50ad17d89931c3',1,]]], + ['cv_5fvrsqrtq_5ff32_2093',['cv_vrsqrtq_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#ga7971ec21fe2577b92fe9da005a981fb4',1,]]], + ['cv_5fvsqrt_5ff32_2094',['cv_vsqrt_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#gacb20dd29e179b19bf38293670d522fc8',1,]]], + ['cv_5fvsqrtq_5ff32_2095',['cv_vsqrtq_f32',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html#ga912f76560209db18ef4afb1d73bdd472',1,]]], + ['cvabstractcamera_2096',['CvAbstractCamera',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html',1,'']]], + ['cvceil_2097',['cvCeil',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga2938a33996791626f9f122e054ed34c4',1,'cvCeil(double value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga859c43a2bc10d1bc89a9a538ec41dc80',1,'cvCeil(float value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf724f15663be3c0130026d0eab7fc5ae',1,'cvCeil(int value)(Global Namespace)']]], + ['cvdef_2eh_2098',['cvdef.h',['https://docs.opencv.org/4.2.0/dc/dcc/cvdef_8h.html',1,'']]], + ['cvdefs_2ehpp_2099',['cvdefs.hpp',['https://docs.opencv.org/4.2.0/df/da4/cvdefs_8hpp.html',1,'']]], + ['cvfeatureevaluator_2100',['CvFeatureEvaluator',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html',1,'cv']]], + ['cvfeatureparams_2101',['CvFeatureParams',['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html',1,'cv::CvFeatureParams'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#a12ddfe0612d04238b6df541e8ab27e19',1,'cv::CvFeatureParams::CvFeatureParams()']]], + ['cvflann_2102',['cvflann',['https://docs.opencv.org/4.2.0/dc/d8c/namespacecvflann.html',1,'']]], + ['cvfloor_2103',['cvFloor',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga1c4500a953c96901f87178f098c781af',1,'cvFloor(double value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gab482bef3966b6f9641d1995c3c05b160',1,'cvFloor(float value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaff8dcaaf14e156f04f42e79a3db5956e',1,'cvFloor(int value)(Global Namespace)']]], + ['cvhaarevaluator_2104',['CvHaarEvaluator',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html',1,'cv']]], + ['cvhaarfeatureparams_2105',['CvHaarFeatureParams',['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html',1,'cv::CvHaarFeatureParams'],['https://docs.opencv.org/4.2.0/d9/d90/classcv_1_1CvHaarFeatureParams.html#a3a721c14f37d0b5203059dc708d79ef9',1,'cv::CvHaarFeatureParams::CvHaarFeatureParams()']]], + ['cvhaldft_2106',['cvhalDFT',['https://docs.opencv.org/4.2.0/de/d27/structcvhalDFT.html',1,'']]], + ['cvhalfilter2d_2107',['cvhalFilter2D',['https://docs.opencv.org/4.2.0/d2/da8/structcvhalFilter2D.html',1,'']]], + ['cvhalkeypoint_2108',['cvhalKeyPoint',['https://docs.opencv.org/4.2.0/d9/daa/structcvhalKeyPoint.html',1,'']]], + ['cvhogevaluator_2109',['CvHOGEvaluator',['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html',1,'cv']]], + ['cvhogfeatureparams_2110',['CvHOGFeatureParams',['https://docs.opencv.org/4.2.0/d4/d4a/structcv_1_1CvHOGFeatureParams.html',1,'cv::CvHOGFeatureParams'],['https://docs.opencv.org/4.2.0/d4/d4a/structcv_1_1CvHOGFeatureParams.html#a64beaa2d7c1d4f5191f8f5730587394e',1,'cv::CvHOGFeatureParams::CvHOGFeatureParams()']]], + ['cvisinf_2111',['cvIsInf',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae04046b1211c77ff19a535bd78c15964',1,'cvIsInf(double value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gafe19ff681b44d364c0e1991d138d680c',1,'cvIsInf(float value)(Global Namespace)']]], + ['cvisnan_2112',['cvIsNaN',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae41ccc6a43a73d4d8e79794c8c544407',1,'cvIsNaN(double value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga572cd5c424274efedf0d43b3484e2ee5',1,'cvIsNaN(float value)(Global Namespace)']]], + ['cvlbpevaluator_2113',['CvLBPEvaluator',['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html',1,'cv']]], + ['cvlbpfeatureparams_2114',['CvLBPFeatureParams',['https://docs.opencv.org/4.2.0/d2/d3c/structcv_1_1CvLBPFeatureParams.html',1,'cv::CvLBPFeatureParams'],['https://docs.opencv.org/4.2.0/d2/d3c/structcv_1_1CvLBPFeatureParams.html#a5f152a53a75178ec96997bcd14d4e7e4',1,'cv::CvLBPFeatureParams::CvLBPFeatureParams()']]], + ['cvparams_2115',['CvParams',['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html',1,'cv::CvParams'],['https://docs.opencv.org/4.2.0/db/d7c/classcv_1_1CvParams.html#a4ed70ff2fa4e0a3f12f93df192ef509e',1,'cv::CvParams::CvParams()']]], + ['cvphotocamera_2116',['CvPhotoCamera',['https://docs.opencv.org/4.2.0/d4/d1d/interfaceCvPhotoCamera.html',1,'']]], + ['cvphotocameradelegate_20_2dp_2dp_2117',['CvPhotoCameraDelegate -p-p',['https://docs.opencv.org/4.2.0/d7/d2f/protocolCvPhotoCameraDelegate_01-p.html',1,'']]], + ['cvresult_2118',['CvResult',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html#ga3fa591dc2d89e8e6b84a2a7202e53367',1,]]], + ['cvround_2119',['cvRound',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga085eca238176984a0b72df2818598d85',1,'cvRound(double value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga977608301213682f12e68dcf1f77c288',1,'cvRound(float value)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga47ead185bfeefb70d09e90d8fe8afde7',1,'cvRound(int value)(Global Namespace)']]], + ['cvstd_2ehpp_2120',['cvstd.hpp',['https://docs.opencv.org/4.2.0/dd/dc7/cvstd_8hpp.html',1,'']]], + ['cvstd_5fwrapper_2ehpp_2121',['cvstd_wrapper.hpp',['https://docs.opencv.org/4.2.0/d7/d47/cvstd__wrapper_8hpp.html',1,'']]], + ['cvt16f32f_2122',['cvt16f32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga90843d0e83d8c1f2bb491d3fe4e45639',1,'cv::hal::cvt16f32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga90843d0e83d8c1f2bb491d3fe4e45639',1,'cvt16f32f()(Global Namespace)']]], + ['cvt32f16f_2123',['cvt32f16f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38a28588accd8729825383f8e8848b9b',1,'cv::hal::cvt32f16f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38a28588accd8729825383f8e8848b9b',1,'cvt32f16f()(Global Namespace)']]], + ['cvt_5f_2124',['cvt_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36e3f3093575c9485606ee7f43945ea5',1,'cv::cudev::cvt_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36e3f3093575c9485606ee7f43945ea5',1,'cvt_()(Global Namespace)']]], + ['cvtbgr5x5tobgr_2125',['cvtBGR5x5toBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga6a5412fa603b31e2ab13ee50272e1d25',1,'cv::hal::cvtBGR5x5toBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga6a5412fa603b31e2ab13ee50272e1d25',1,'cvtBGR5x5toBGR()(Global Namespace)']]], + ['cvtbgr5x5togray_2126',['cvtBGR5x5toGray',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga613ae5d9e9aaaec3e8b11f060d7c84df',1,'cv::hal::cvtBGR5x5toGray()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga613ae5d9e9aaaec3e8b11f060d7c84df',1,'cvtBGR5x5toGray()(Global Namespace)']]], + ['cvtbgrtobgr_2127',['cvtBGRtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga93098228063985aa2bababe21f76e8bf',1,'cv::hal::cvtBGRtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga93098228063985aa2bababe21f76e8bf',1,'cvtBGRtoBGR()(Global Namespace)']]], + ['cvtbgrtobgr5x5_2128',['cvtBGRtoBGR5x5',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gab0ee904b73ac326cd6a43a9d6d3fa319',1,'cv::hal::cvtBGRtoBGR5x5()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gab0ee904b73ac326cd6a43a9d6d3fa319',1,'cvtBGRtoBGR5x5()(Global Namespace)']]], + ['cvtbgrtogray_2129',['cvtBGRtoGray',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga6cec65e9e9aa10cd364c2f558c34e808',1,'cv::hal::cvtBGRtoGray()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga6cec65e9e9aa10cd364c2f558c34e808',1,'cvtBGRtoGray()(Global Namespace)']]], + ['cvtbgrtohsv_2130',['cvtBGRtoHSV',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gafcf8f9a5fdc881a7acafc4f73eac06c7',1,'cv::hal::cvtBGRtoHSV()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gafcf8f9a5fdc881a7acafc4f73eac06c7',1,'cvtBGRtoHSV()(Global Namespace)']]], + ['cvtbgrtolab_2131',['cvtBGRtoLab',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga8cb363c62e2247a765fa38febaa8bc37',1,'cv::hal::cvtBGRtoLab()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga8cb363c62e2247a765fa38febaa8bc37',1,'cvtBGRtoLab()(Global Namespace)']]], + ['cvtbgrtothreeplaneyuv_2132',['cvtBGRtoThreePlaneYUV',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga4ba4f7bf73988e836d18ee61e76f9019',1,'cv::hal::cvtBGRtoThreePlaneYUV()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga4ba4f7bf73988e836d18ee61e76f9019',1,'cvtBGRtoThreePlaneYUV()(Global Namespace)']]], + ['cvtbgrtotwoplaneyuv_2133',['cvtBGRtoTwoPlaneYUV',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga1d485a19d2d1f427cada0288c468b5d0',1,'cv::hal::cvtBGRtoTwoPlaneYUV()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga1d485a19d2d1f427cada0288c468b5d0',1,'cvtBGRtoTwoPlaneYUV()(Global Namespace)']]], + ['cvtbgrtoxyz_2134',['cvtBGRtoXYZ',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga5342b7dbea365565170e30de4cf13647',1,'cv::hal::cvtBGRtoXYZ()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga5342b7dbea365565170e30de4cf13647',1,'cvtBGRtoXYZ()(Global Namespace)']]], + ['cvtbgrtoyuv_2135',['cvtBGRtoYUV',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga8e17075eb6abf950d2aab9bf9b4ed66d',1,'cv::hal::cvtBGRtoYUV()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga8e17075eb6abf950d2aab9bf9b4ed66d',1,'cvtBGRtoYUV()(Global Namespace)']]], + ['cvtcolor_2136',['cvtColor',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga397ae87e1288a81d2363b61574eb8cab',1,'cv::cvtColor()'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga48d0f208181d5ca370d8ff6b62cbe826',1,'cv::cuda::cvtColor()'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga397ae87e1288a81d2363b61574eb8cab',1,'cvtColor(InputArray src, OutputArray dst, int code, int dstCn=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga48d0f208181d5ca370d8ff6b62cbe826',1,'cvtColor(InputArray src, OutputArray dst, int code, int dcn=0, Stream &stream=Stream::Null())(Global Namespace)']]], + ['cvtcolortwoplane_2137',['cvtColorTwoPlane',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga8e873314e72a1a6c0252375538fbf753',1,'cv::cvtColorTwoPlane()'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga8e873314e72a1a6c0252375538fbf753',1,'cvtColorTwoPlane()(Global Namespace)']]], + ['cvtgraytobgr_2138',['cvtGraytoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga843c86dcf81c9cb6e6e0dc97952fe5d6',1,'cv::hal::cvtGraytoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga843c86dcf81c9cb6e6e0dc97952fe5d6',1,'cvtGraytoBGR()(Global Namespace)']]], + ['cvtgraytobgr5x5_2139',['cvtGraytoBGR5x5',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga6753adfed75b0adff0a2938a66c4df64',1,'cv::hal::cvtGraytoBGR5x5()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga6753adfed75b0adff0a2938a66c4df64',1,'cvtGraytoBGR5x5()(Global Namespace)']]], + ['cvthsvtobgr_2140',['cvtHSVtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gad00ad9bfcfa57596b81d16437f59aaba',1,'cv::hal::cvtHSVtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gad00ad9bfcfa57596b81d16437f59aaba',1,'cvtHSVtoBGR()(Global Namespace)']]], + ['cvtlabtobgr_2141',['cvtLabtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gab726ed6f0db14eafb657c1644474e7d4',1,'cv::hal::cvtLabtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gab726ed6f0db14eafb657c1644474e7d4',1,'cvtLabtoBGR()(Global Namespace)']]], + ['cvtmultipliedrgbatorgba_2142',['cvtMultipliedRGBAtoRGBA',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga249d8bbee8894e169c31b97e2ff75482',1,'cv::hal::cvtMultipliedRGBAtoRGBA()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga249d8bbee8894e169c31b97e2ff75482',1,'cvtMultipliedRGBAtoRGBA()(Global Namespace)']]], + ['cvtoneplaneyuvtobgr_2143',['cvtOnePlaneYUVtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga653c2a33761f5fa7de5e1d4acf8f0325',1,'cv::hal::cvtOnePlaneYUVtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga653c2a33761f5fa7de5e1d4acf8f0325',1,'cvtOnePlaneYUVtoBGR()(Global Namespace)']]], + ['cvtrgbatomultipliedrgba_2144',['cvtRGBAtoMultipliedRGBA',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gaceacd38bef5fee2d702af596a55fa97c',1,'cv::hal::cvtRGBAtoMultipliedRGBA()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gaceacd38bef5fee2d702af596a55fa97c',1,'cvtRGBAtoMultipliedRGBA()(Global Namespace)']]], + ['cvtthreeplaneyuvtobgr_2145',['cvtThreePlaneYUVtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gad66992caf43d79b68182b8192f093d3e',1,'cv::hal::cvtThreePlaneYUVtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gad66992caf43d79b68182b8192f093d3e',1,'cvtThreePlaneYUVtoBGR()(Global Namespace)']]], + ['cvttwoplaneyuvtobgr_2146',['cvtTwoPlaneYUVtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gab88de89b3d5fdf9b3d543a276d8b6f3e',1,'cv::hal::cvtTwoPlaneYUVtoBGR(const uchar *src_data, size_t src_step, uchar *dst_data, size_t dst_step, int dst_width, int dst_height, int dcn, bool swapBlue, int uIdx)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gac266a4ea6caa84aedd1545ead54f48c8',1,'cv::hal::cvtTwoPlaneYUVtoBGR(const uchar *y_data, const uchar *uv_data, size_t src_step, uchar *dst_data, size_t dst_step, int dst_width, int dst_height, int dcn, bool swapBlue, int uIdx)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gab88de89b3d5fdf9b3d543a276d8b6f3e',1,'cvtTwoPlaneYUVtoBGR(const uchar *src_data, size_t src_step, uchar *dst_data, size_t dst_step, int dst_width, int dst_height, int dcn, bool swapBlue, int uIdx)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gac266a4ea6caa84aedd1545ead54f48c8',1,'cvtTwoPlaneYUVtoBGR(const uchar *y_data, const uchar *uv_data, size_t src_step, uchar *dst_data, size_t dst_step, int dst_width, int dst_height, int dcn, bool swapBlue, int uIdx)(Global Namespace)']]], + ['cvtxyztobgr_2147',['cvtXYZtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gaa7a1b7cf283b8b67864de33e4e837d6d',1,'cv::hal::cvtXYZtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gaa7a1b7cf283b8b67864de33e4e837d6d',1,'cvtXYZtoBGR()(Global Namespace)']]], + ['cvtype_2148',['CvType',['https://docs.opencv.org/4.2.0/d1/def/structcv_1_1flann_1_1CvType.html',1,'cv::flann']]], + ['cvtype_3c_20char_20_3e_2149',['CvType< char >',['https://docs.opencv.org/4.2.0/dc/d89/structcv_1_1flann_1_1CvType_3_01char_01_4.html',1,'cv::flann']]], + ['cvtype_3c_20double_20_3e_2150',['CvType< double >',['https://docs.opencv.org/4.2.0/dc/d69/structcv_1_1flann_1_1CvType_3_01double_01_4.html',1,'cv::flann']]], + ['cvtype_3c_20float_20_3e_2151',['CvType< float >',['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1flann_1_1CvType_3_01float_01_4.html',1,'cv::flann']]], + ['cvtype_3c_20short_20_3e_2152',['CvType< short >',['https://docs.opencv.org/4.2.0/d2/def/structcv_1_1flann_1_1CvType_3_01short_01_4.html',1,'cv::flann']]], + ['cvtype_3c_20unsigned_20char_20_3e_2153',['CvType< unsigned char >',['https://docs.opencv.org/4.2.0/d7/da5/structcv_1_1flann_1_1CvType_3_01unsigned_01char_01_4.html',1,'cv::flann']]], + ['cvtype_3c_20unsigned_20short_20_3e_2154',['CvType< unsigned short >',['https://docs.opencv.org/4.2.0/d9/d57/structcv_1_1flann_1_1CvType_3_01unsigned_01short_01_4.html',1,'cv::flann']]], + ['cvtyuvtobgr_2155',['cvtYUVtoBGR',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gae2655422efaaa35ad72b5f0af0b3d5dc',1,'cv::hal::cvtYUVtoBGR()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#gae2655422efaaa35ad72b5f0af0b3d5dc',1,'cvtYUVtoBGR(const uchar *src_data, size_t src_step, uchar *dst_data, size_t dst_step, int width, int height, int depth, int dcn, bool swapBlue, bool isCbCr)(Global Namespace)']]], + ['cvv_2156',['cvv',['https://docs.opencv.org/4.2.0/dd/d06/namespacecvv.html',1,'']]], + ['cvv_2ehpp_2157',['cvv.hpp',['https://docs.opencv.org/4.2.0/d2/dcf/cvv_2cvv_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d7f/cvv_8hpp.html',1,'(Global Namespace)']]], + ['cvv_3a_3aimpl_2158',['impl',['https://docs.opencv.org/4.2.0/d7/d84/namespacecvv_1_1impl.html',1,'cvv']]], + ['cvvideocamera_2159',['CvVideoCamera',['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html',1,'']]], + ['cvvideocameradelegate_20_2dp_2dp_2160',['CvVideoCameraDelegate -p-p',['https://docs.opencv.org/4.2.0/d3/d54/protocolCvVideoCameraDelegate_01-p.html',1,'']]], + ['cwchar_2161',['cwchar',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00254.html',1,'']]], + ['cwctype_2162',['cwctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00260.html',1,'']]], + ['cwisebinaryop_2163',['CwiseBinaryOp',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseBinaryOp.html',1,'Eigen']]], + ['cwisenullaryop_2164',['CwiseNullaryOp',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseNullaryOp.html',1,'Eigen']]], + ['cwiseternaryop_2165',['CwiseTernaryOp',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseTernaryOp.html',1,'Eigen']]], + ['cwiseunaryop_2166',['CwiseUnaryOp',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseUnaryOp.html',1,'Eigen']]], + ['cwiseunaryview_2167',['CwiseUnaryView',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseUnaryView.html',1,'Eigen']]], + ['cxxabi_2eh_2168',['cxxabi.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00023.html',1,'']]], + ['cxxabi_5fforced_2eh_2169',['cxxabi_forced.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00314.html',1,'']]], + ['cxxabi_5finit_5fexception_2eh_2170',['cxxabi_init_exception.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00317.html',1,'']]], + ['cxxabi_5ftweaks_2eh_2171',['cxxabi_tweaks.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00686.html',1,'']]], + ['cyan_2172',['cyan',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#acf7eaff21cdb5271925b5c326b9a1919',1,'cv::viz::Color']]], + ['cyl_5fbessel_5fi_2173',['cyl_bessel_i',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1c9b5a5c36f000a4f0a55f7fcc486cb0',1,'std::cyl_bessel_i()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga07dddd9af049c8700682f9de63f49430',1,'std::tr1::cyl_bessel_i()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1c9b5a5c36f000a4f0a55f7fcc486cb0',1,'cyl_bessel_i(_Tpnu __nu, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga07dddd9af049c8700682f9de63f49430',1,'cyl_bessel_i(_Tpnu __nu, _Tp __x)(Global Namespace)']]], + ['cyl_5fbessel_5fif_2174',['cyl_bessel_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaaf738427d4da0bda66bc2274dfb853a7',1,'std::cyl_bessel_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaaf738427d4da0bda66bc2274dfb853a7',1,'cyl_bessel_if()(Global Namespace)']]], + ['cyl_5fbessel_5fil_2175',['cyl_bessel_il',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gab7962629216d03efb8ecaa3f70c6878f',1,'std::cyl_bessel_il()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gab7962629216d03efb8ecaa3f70c6878f',1,'cyl_bessel_il()(Global Namespace)']]], + ['cyl_5fbessel_5fj_2176',['cyl_bessel_j',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga47e21a13b6d68d0d7f057699bd3b3ce0',1,'std::cyl_bessel_j()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga9f8aeb36e3e3ee1f6e15d597a46d772b',1,'std::tr1::cyl_bessel_j()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga47e21a13b6d68d0d7f057699bd3b3ce0',1,'cyl_bessel_j(_Tpnu __nu, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga9f8aeb36e3e3ee1f6e15d597a46d772b',1,'cyl_bessel_j(_Tpnu __nu, _Tp __x)(Global Namespace)']]], + ['cyl_5fbessel_5fjf_2177',['cyl_bessel_jf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga15731a7bccd6351d28353e3c4c2a2d23',1,'std::cyl_bessel_jf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga15731a7bccd6351d28353e3c4c2a2d23',1,'cyl_bessel_jf()(Global Namespace)']]], + ['cyl_5fbessel_5fjl_2178',['cyl_bessel_jl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gade8e94a80520a8b628b2d658755b25c0',1,'std::cyl_bessel_jl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gade8e94a80520a8b628b2d658755b25c0',1,'cyl_bessel_jl()(Global Namespace)']]], + ['cyl_5fbessel_5fk_2179',['cyl_bessel_k',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga76dcd3884620955680112aca0d327ada',1,'std::cyl_bessel_k()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga77fcb104653b63975ae800e48fb72ed0',1,'std::tr1::cyl_bessel_k()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga76dcd3884620955680112aca0d327ada',1,'cyl_bessel_k(_Tpnu __nu, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga77fcb104653b63975ae800e48fb72ed0',1,'cyl_bessel_k(_Tpnu __nu, _Tp __x)(Global Namespace)']]], + ['cyl_5fbessel_5fkf_2180',['cyl_bessel_kf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1f50047f9aab0ec8b1a1615fe9fbe32f',1,'std::cyl_bessel_kf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1f50047f9aab0ec8b1a1615fe9fbe32f',1,'cyl_bessel_kf()(Global Namespace)']]], + ['cyl_5fbessel_5fkl_2181',['cyl_bessel_kl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gac35194b926270d7857d651e06198c7d3',1,'std::cyl_bessel_kl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gac35194b926270d7857d651e06198c7d3',1,'cyl_bessel_kl()(Global Namespace)']]], + ['cyl_5fneumann_2182',['cyl_neumann',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga5b7c72ab85e361cbd73f1a3b5f0725a6',1,'std::cyl_neumann()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga36bb3adce8d3308d85891700c78bea91',1,'std::tr1::cyl_neumann()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga5b7c72ab85e361cbd73f1a3b5f0725a6',1,'cyl_neumann(_Tpnu __nu, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga36bb3adce8d3308d85891700c78bea91',1,'cyl_neumann(_Tpnu __nu, _Tp __x)(Global Namespace)']]], + ['cyl_5fneumannf_2183',['cyl_neumannf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga604c13e8f2bb7cd3c7c91d8b19d6b13a',1,'std::cyl_neumannf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga604c13e8f2bb7cd3c7c91d8b19d6b13a',1,'cyl_neumannf()(Global Namespace)']]], + ['cyl_5fneumannl_2184',['cyl_neumannl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf8986bae9a523c48d861d233835bda8f',1,'std::cyl_neumannl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaf8986bae9a523c48d861d233835bda8f',1,'cyl_neumannl()(Global Namespace)']]], + ['cylindricalportraitprojector_2185',['CylindricalPortraitProjector',['https://docs.opencv.org/4.2.0/df/d3f/structcv_1_1detail_1_1CylindricalPortraitProjector.html',1,'cv::detail']]], + ['cylindricalportraitwarper_2186',['CylindricalPortraitWarper',['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1detail_1_1CylindricalPortraitWarper.html',1,'cv::detail::CylindricalPortraitWarper'],['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1detail_1_1CylindricalPortraitWarper.html#a6f71c3d46b911b845a03511cb71a4188',1,'cv::detail::CylindricalPortraitWarper::CylindricalPortraitWarper()']]], + ['cylindricalprojector_2187',['CylindricalProjector',['https://docs.opencv.org/4.2.0/dd/d96/structcv_1_1detail_1_1CylindricalProjector.html',1,'cv::detail']]], + ['cylindricalwarper_2188',['CylindricalWarper',['https://docs.opencv.org/4.2.0/d7/df6/classcv_1_1CylindricalWarper.html',1,'cv::CylindricalWarper'],['https://docs.opencv.org/4.2.0/d3/dd6/classcv_1_1detail_1_1CylindricalWarper.html',1,'cv::detail::CylindricalWarper'],['https://docs.opencv.org/4.2.0/d3/dd6/classcv_1_1detail_1_1CylindricalWarper.html#ac005b4b0e4bc4d7266f26fd4cc7e19dc',1,'cv::detail::CylindricalWarper::CylindricalWarper()']]], + ['cylindricalwarpergpu_2189',['CylindricalWarperGpu',['https://docs.opencv.org/4.2.0/d9/dbd/classcv_1_1detail_1_1CylindricalWarperGpu.html',1,'cv::detail::CylindricalWarperGpu'],['https://docs.opencv.org/4.2.0/d9/dbd/classcv_1_1detail_1_1CylindricalWarperGpu.html#a3af4ec2a705ff9f0f807d9e8bcac2b33',1,'cv::detail::CylindricalWarperGpu::CylindricalWarperGpu()']]], + ['cyrillic_2190',['cyrillic',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a0972c81463e8267ad1d8fb16ff72a803',1,'cv::QtFont']]] ]; diff --git a/search/all_d.js b/search/all_d.js index ea42f6f6..69b7ba97 100644 --- a/search/all_d.js +++ b/search/all_d.js @@ -3,751 +3,741 @@ var searchData= ['daisy_0',['DAISY',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html',1,'cv::xfeatures2d']]], ['dampingfactor_1',['dampingFactor',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#a9f10c0523e213df8dea6995e9105a8fe',1,'cv::optflow::OpticalFlowPCAFlow']]], ['dark_2',['dark',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ggaa38573e5a0fc4bf3706c054bf78abe32ac12eb3aa4faede9c0c126f206ac20b84',1,'cv::datasets::dark'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#ggaa38573e5a0fc4bf3706c054bf78abe32ac12eb3aa4faede9c0c126f206ac20b84',1,'dark(Global Namespace)']]], - ['data_3',['Data',['https://docs.opencv.org/4.2.0/de/d4f/structcv_1_1face_1_1FacemarkAAM_1_1Data.html',1,'cv::face::FacemarkAAM::Data'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1gapi_1_1wip_1_1Data.html',1,'cv::gapi::wip::Data']]], + ['data_3',['Data',['https://docs.opencv.org/4.2.0/de/d4f/structcv_1_1face_1_1FacemarkAAM_1_1Data.html',1,'cv::face::FacemarkAAM::Data'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1gapi_1_1wip_1_1Data.html',1,'cv::gapi::wip::Data'],['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'Support Vector Machines for Non-Linearly Separable Data']]], ['data_4',['data',['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#a08c60e63849725a9e983941960ac3b5a',1,'cv::cudev::GlobPtr::data'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a5139f9492f9079c7b9e414d50da332a3',1,'cv::cuda::GpuMat::data'],['https://docs.opencv.org/4.2.0/d7/d48/structhashnode__i.html#aacbedabd5a4a640f1cfc7e9f492074ae',1,'hashnode_i::data'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a22e267551b43057c9371aa927cc34ee9',1,'cv::cuda::HostMem::data'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a4d33bed1c850265370d2af0ff02e1564',1,'cv::Mat::data'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a8689f15398515469e301dfb6b466458e',1,'cv::gapi::own::detail::MatHeader::data'],['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#adfd8254b03e8c3ad7b3243befa502c48',1,'cv::face::StandardCollector::data'],['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a30205a589192d0ec46b09211978f5b02',1,'cv::datasets::TRACK_alov::data'],['https://docs.opencv.org/4.2.0/dc/d52/classcv_1_1datasets_1_1TRACK__vot.html#a5c7b34768d8e4c11dd6e34730df624a1',1,'cv::datasets::TRACK_vot::data'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a20e87bb7088a637bdd9e1bc6ed649419',1,'cv::UMatData::data'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a4992346bfec9774b2572253a89cdd330',1,'cv::AutoBuffer::data()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a2cb4f4459ce4e3969f3b1586bd5092c3',1,'cv::AutoBuffer::data() const'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a4992346bfec9774b2572253a89cdd330',1,'AutoBuffer< double, 1 >::data()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a2cb4f4459ce4e3969f3b1586bd5092c3',1,'AutoBuffer< double, 1 >::data() const'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a4992346bfec9774b2572253a89cdd330',1,'AutoBuffer< int64, 1 >::data()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a2cb4f4459ce4e3969f3b1586bd5092c3',1,'AutoBuffer< int64, 1 >::data() const'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a4992346bfec9774b2572253a89cdd330',1,'AutoBuffer< String, 1 >::data()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a2cb4f4459ce4e3969f3b1586bd5092c3',1,'AutoBuffer< String, 1 >::data() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a4dd3ac918e886a29d8a0bf9331f2e8d9',1,'__gnu_cxx::__versa_string::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7998fb98c9eddd604864547d4ed4a80f',1,'basic_string< _CharT >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7998fb98c9eddd604864547d4ed4a80f',1,'basic_string< _CharT, _Traits, _Allocator >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7998fb98c9eddd604864547d4ed4a80f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7998fb98c9eddd604864547d4ed4a80f',1,'basic_string< char >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7998fb98c9eddd604864547d4ed4a80f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7998fb98c9eddd604864547d4ed4a80f',1,'basic_string< char_type, _Traits, _Alloc >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7998fb98c9eddd604864547d4ed4a80f',1,'basic_string< value_type >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'match_results< _Bi_iter >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a7998fb98c9eddd604864547d4ed4a80f',1,'std::basic_string::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'std::match_results::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'std::vector::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< __diff_type >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< _CharClassT >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< _CharT >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< _Cmpt >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< _Node *, _Nodeptr_Alloc >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< _RealType >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< _State< _TraitsT::char_type > >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< _StringT >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< block_type, allocator_type >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< Catalog_info * >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< double >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< int >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< result_type >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< size_t >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< std::pair< _BiIter, int > >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< std::pair< _StateIdT, std::vector > >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< std::pair< _StrTransT, _StrTransT > >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< sub_match< _Bi_iter >, _Alloc >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::data()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#abee0514d69c004f06f06e37e33b6104b',1,'vector< sub_match< _BiIter >, _Alloc >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a1bee30414766e9116a7abed067ca8007',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'Eigen::PlainObjectBase::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'Eigen::PlainObjectBase::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad12a492bcadea9b65ccd9bc8404c01f1',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ac54123f62de4c46a9107ff53890b6116',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::data() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aefd183e4e0ca89c39b78d5ad7cf3e014',1,'Eigen::Transform::data()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a432669c64a0d6925ee5ea54f76d24a32',1,'Eigen::Transform::data() const'],['https://docs.opencv.org/4.2.0/db/dfe/group__plot.html',1,'Plot function for Mat data']]], - ['data_5',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], - ['data_20format_20hdf_20i_20o_6',['The Hierarchical Data Format (hdf) I/O',['https://docs.opencv.org/4.2.0/d3/d00/tutorial_table_of_content_hdf.html',1,'']]], - ['data_20format_20i_20o_20routines_7',['Hierarchical Data Format I/O routines',['https://docs.opencv.org/4.2.0/db/d77/group__hdf.html',1,'']]], - ['data_20format_20version_205_8',['Hierarchical Data Format version 5',['https://docs.opencv.org/4.2.0/d6/dee/group__hdf5.html',1,'']]], - ['data_20generation_20using_20icosphere_9',['Training data generation using Icosphere',['https://docs.opencv.org/4.2.0/d6/df4/tutorial_data_generation.html',1,'']]], - ['data_20structure_20type_10',['Data Structure Type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01539.html',1,'']]], - ['data_20structures_11',['Data Structures',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html',1,'Data Structures'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01536.html',1,'Policy-Based Data Structures'],['https://docs.opencv.org/4.2.0/d5/df1/tutorial_js_some_data_structures.html',1,'Some Data Structures']]], - ['data_20types_12',['G-API Data Types',['https://docs.opencv.org/4.2.0/db/df1/group__gapi__data__objects.html',1,'']]], - ['data_20using_20knn_13',['OCR of Hand-written Data using kNN',['https://docs.opencv.org/4.2.0/d8/d4b/tutorial_py_knn_opencv.html',1,'']]], - ['data_20using_20svm_14',['OCR of Hand-written Data using SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'']]], - ['data_5fas_5fcol_15',['DATA_AS_COL',['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#ae8a94a2add0555b0414e85c08ff67f50a2c52b7c4c9721a3e04a1d6699e738093',1,'cv::PCA']]], - ['data_5fas_5frow_16',['DATA_AS_ROW',['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#ae8a94a2add0555b0414e85c08ff67f50a159399e962048f705645483ca16e9fd6',1,'cv::PCA']]], - ['data_5fgeneration_2emarkdown_17',['data_generation.markdown',['https://docs.opencv.org/4.2.0/d5/d8e/data__generation_8markdown.html',1,'']]], - ['dataclock_18',['dataclock',['../namespacerobot_1_1types.html#ae853854e1c1dbbb2dc44e06838c4cf54',1,'robot::types']]], - ['datadepth_19',['DataDepth',['https://docs.opencv.org/4.2.0/d7/d0e/classcv_1_1DataDepth.html',1,'cv']]], - ['dataend_20',['dataend',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ad76c4f58490134f1acf3e580e669c58b',1,'cv::cuda::GpuMat::dataend'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a895b08a1958e4d6a73bd5410a7b86c3b',1,'cv::cuda::HostMem::dataend'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ae756e84c94cbcf4c152ed0e67edb71ca',1,'cv::Mat::dataend']]], - ['datalimit_21',['datalimit',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a21a0a0eb9814f0093452601fcbdc8a46',1,'cv::Mat']]], - ['datamov_5futils_2ehpp_22',['datamov_utils.hpp',['https://docs.opencv.org/4.2.0/df/dcf/datamov__utils_8hpp.html',1,'']]], - ['datapoint_23',['DataPoint',['../classrobot_1_1types_1_1DataPoint.html',1,'robot::types::DataPoint< T >'],['../classrobot_1_1types_1_1DataPoint.html#a81904e68e4e9e64bb541bcb2f3f8247c',1,'robot::types::DataPoint::DataPoint()'],['../classrobot_1_1types_1_1DataPoint.html#a2ad044a12fa674b131ab0a9ba0528481',1,'robot::types::DataPoint::DataPoint(T data)'],['../classrobot_1_1types_1_1DataPoint.html#a5e1f88b845b3194f26540bf6acc351b8',1,'robot::types::DataPoint::DataPoint(datatime_t time, T data)']]], - ['datapoint_3c_20eigen_3a_3aquaternion_20_3e_24',['DataPoint< Eigen::Quaternion >',['../classrobot_1_1types_1_1DataPoint.html',1,'robot::types']]], - ['datapoint_3c_20navtypes_3a_3agpscoords_5ft_20_3e_25',['DataPoint< navtypes::gpscoords_t >',['../classrobot_1_1types_1_1DataPoint.html',1,'robot::types']]], - ['dataset_26',['Dataset',['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html',1,'cv::datasets::Dataset'],['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html#a1ee05dbac222fa10c0fe6dd6b8713b48',1,'cv::datasets::Dataset::Dataset()']]], - ['dataset_2ehpp_27',['dataset.hpp',['https://docs.opencv.org/4.2.0/dc/d6a/dataset_8hpp.html',1,'']]], - ['datasets_28',['Creating, Writing and Reading Datasets',['https://docs.opencv.org/4.2.0/d4/d93/tutorial_hdf_create_read_write_datasets.html',1,'']]], - ['datasets_29',['Framework for working with different datasets',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html',1,'']]], - ['datasettype_30',['datasetType',['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html#ga570cd866657e421a9d34fd891214cdac',1,'cv::datasets::datasetType'],['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html#ga570cd866657e421a9d34fd891214cdac',1,'datasetType(Global Namespace)']]], - ['datastart_31',['datastart',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ade4a4dfc61facd5f18143b4c9d56dbae',1,'cv::cuda::GpuMat::datastart'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a5e62aeda0a11c82ed104ad2c0475e1fb',1,'cv::cuda::HostMem::datastart'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aeda6d607bfc629a95f59e7b538832172',1,'cv::Mat::datastart']]], - ['datatime_5ft_32',['datatime_t',['../namespacerobot_1_1types.html#a35269b68b316ac7d17d073a5d1a419b7',1,'robot::types']]], - ['datatype_33',['DataType',['https://docs.opencv.org/4.2.0/d0/d3a/classcv_1_1DataType.html',1,'cv']]], - ['datatype_34',['dataType',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#af8db03a57fe9b8ddcbc09f2ff90e3797',1,'cv::tracking::UnscentedKalmanFilterParams']]], - ['date_5forder_35',['date_order',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a876bb3dcd1727291a72dbb4dd890e229',1,'std::time_get::date_order()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a876bb3dcd1727291a72dbb4dd890e229',1,'std::time_get_byname::date_order()']]], - ['db_36',['db',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a172ccaaba996db5201af1c17c04a5fe8ae6f9dbf9718c71c2bc102b015f57b508',1,'cv']]], - ['dc_37',['dc',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a172ccaaba996db5201af1c17c04a5fe8abadade4f1a640599f9a68ab13df7a8b8',1,'cv']]], - ['dct_38',['dct',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga85aad4d668c01fbd64825f589e3696d4',1,'cv::dct()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga85aad4d668c01fbd64825f589e3696d4',1,'dct()(Global Namespace)']]], - ['dct2d_39',['DCT2D',['https://docs.opencv.org/4.2.0/d5/d57/structcv_1_1hal_1_1DCT2D.html',1,'cv::hal']]], - ['dct_5fimage_5fdenoising_2ehpp_40',['dct_image_denoising.hpp',['https://docs.opencv.org/4.2.0/da/dd8/dct__image__denoising_8hpp.html',1,'']]], - ['dct_5finverse_41',['DCT_INVERSE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca7d18108cbce9d52e6496633c713587da',1,'cv::DCT_INVERSE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca7d18108cbce9d52e6496633c713587da',1,'DCT_INVERSE(Global Namespace)']]], - ['dct_5frows_42',['DCT_ROWS',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca49bc8de8aedbe7fabb8960445133e494',1,'cv::DCT_ROWS'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca49bc8de8aedbe7fabb8960445133e494',1,'DCT_ROWS(Global Namespace)']]], - ['dctdenoising_43',['dctDenoising',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga14261b2fd705095a0c405da342fdff55',1,'cv::xphoto::dctDenoising()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga14261b2fd705095a0c405da342fdff55',1,'dctDenoising()(Global Namespace)']]], - ['ddot_44',['ddot',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'cv::Matx::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< _Tp, cn, 1 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, 1, 3 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, 2, 2 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, 2, 3 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, 3, 3 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, 3, 4 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, 4, 4 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, cn, 1 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< float, 2, 3 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< float, 3, 3 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< float, cn, 1 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< float_type, 4, 4 >::ddot()'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a7d7124092dacacf1fdbb473b308d87d1',1,'cv::Point3_::ddot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a7df967231a76a7c6c941ba170954ee8a',1,'cv::Point_::ddot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a7df967231a76a7c6c941ba170954ee8a',1,'Point_< double >::ddot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a7df967231a76a7c6c941ba170954ee8a',1,'Point_< float >::ddot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a7df967231a76a7c6c941ba170954ee8a',1,'Point_< int >::ddot()']]], - ['dealloc_45',['dealloc',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#a2ed9d487ec85b2b1fdab8f1d771b9573',1,'INCVMemAllocator::dealloc()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#aa525d97b8fd62d312a0a9c3773850691',1,'NCVMemNativeAllocator::dealloc()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#acfa65d226c7899813143e9a51ad6d9b2',1,'NCVMemStackAllocator::dealloc()']]], - ['deallocate_46',['deallocate',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#ae5535db0a39ba335418da7a7173f333d',1,'cv::Allocator::deallocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#aab78aeff0108ad5ba8c96baafd58702b',1,'cv::AutoBuffer::deallocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#aab78aeff0108ad5ba8c96baafd58702b',1,'AutoBuffer< double, 1 >::deallocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#aab78aeff0108ad5ba8c96baafd58702b',1,'AutoBuffer< int64, 1 >::deallocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#aab78aeff0108ad5ba8c96baafd58702b',1,'AutoBuffer< String, 1 >::deallocate()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ac6e9cdf9b450e360f005978b4e981b1a',1,'cv::Mat::deallocate()'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#ae1fc4401763093dbd126570562a3e0f1',1,'cv::MatAllocator::deallocate()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a8c3716c2b363388bb8e59212a50e6ba5',1,'cv::UMat::deallocate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#ae5f6b86b98b17e2ba39243ca8eaf4ee1',1,'__alloc_traits< _Tp_alloc_type >::deallocate(_Tp_alloc_type &__a, pointer __p, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ae5f6b86b98b17e2ba39243ca8eaf4ee1',1,'__alloc_traits< _Tp_alloc_type >::deallocate(_Tp_alloc_type &__a, pointer __p, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#ae5f6b86b98b17e2ba39243ca8eaf4ee1',1,'__gnu_cxx::__alloc_traits::deallocate(_Alloc &__a, pointer __p, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ae5f6b86b98b17e2ba39243ca8eaf4ee1',1,'__gnu_cxx::__alloc_traits::deallocate(_Alloc &__a, pointer __p, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ae5f6b86b98b17e2ba39243ca8eaf4ee1',1,'allocator_traits< _Tp_alloc_type >::deallocate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ae5f6b86b98b17e2ba39243ca8eaf4ee1',1,'std::allocator_traits::deallocate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a221deccca32f2195cfe2d521e14c736c',1,'std::allocator_traits< allocator< _Tp > >::deallocate()']]], - ['deblockmode_47',['DeblockMode',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a7c5853999aa0b35008758f560df63a82',1,'cv::cudacodec::EncoderParams']]], - ['deblur_48',['deblur',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a5892088e5543163d6d6f18467d200f32',1,'cv::videostab::DeblurerBase::deblur()'],['https://docs.opencv.org/4.2.0/dc/d86/classcv_1_1videostab_1_1NullDeblurer.html#a0c1480a2ab0491bbf34a872c06fb625b',1,'cv::videostab::NullDeblurer::deblur()'],['https://docs.opencv.org/4.2.0/df/d5b/classcv_1_1videostab_1_1WeightingDeblurer.html#a09f6d7f55c474165423c72db7afe3d60',1,'cv::videostab::WeightingDeblurer::deblur()']]], - ['deblur_20filter_49',['Deblur Filter',['https://docs.opencv.org/4.2.0/d1/dfd/tutorial_motion_deblur_filter.html',1,'Motion Deblur Filter'],['https://docs.opencv.org/4.2.0/de/d3c/tutorial_out_of_focus_deblur_filter.html',1,'Out-of-focus Deblur Filter']]], - ['deblurer_5f_50',['deblurer_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#adae3e5a562d4491fc2cbc1bb1b2a6132',1,'cv::videostab::StabilizerBase']]], - ['deblurerbase_51',['DeblurerBase',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html',1,'cv::videostab::DeblurerBase'],['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#ae02367fc462a4caabcb56bafbd5bcc11',1,'cv::videostab::DeblurerBase::DeblurerBase()']]], - ['deblurrer_52',['deblurrer',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a1ce9686e0c40d131f606cfa1feb73181',1,'cv::videostab::StabilizerBase']]], - ['deblurring_2ehpp_53',['deblurring.hpp',['https://docs.opencv.org/4.2.0/d4/db5/deblurring_8hpp.html',1,'']]], - ['debug_54',['debug',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#ac0520f0ff5216059099da94fd502683c',1,'cv::gapi::fluid::Buffer']]], - ['debug_2eh_55',['debug.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00752.html',1,'']]], - ['debug_2farray_56',['debug/array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16598.html',1,'']]], - ['debug_2fbitset_57',['debug/bitset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16610.html',1,'']]], - ['debug_2fdeque_58',['debug/deque',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16802.html',1,'']]], - ['debug_2fforward_5flist_59',['debug/forward_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16904.html',1,'']]], - ['debug_2flist_60',['debug/list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17057.html',1,'']]], - ['debug_2fmap_61',['debug/map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17066.html',1,'']]], - ['debug_2fmap_2eh_62',['debug/map.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17075.html',1,'']]], - ['debug_2fmultimap_2eh_63',['debug/multimap.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17087.html',1,'']]], - ['debug_2fmultiset_2eh_64',['debug/multiset.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17093.html',1,'']]], - ['debug_2fset_65',['debug/set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17213.html',1,'']]], - ['debug_2fset_2eh_66',['debug/set.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17222.html',1,'']]], - ['debug_2fstl_5fiterator_2eh_67',['debug/stl_iterator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17264.html',1,'']]], - ['debug_2fstring_68',['debug/string',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17267.html',1,'']]], - ['debug_2funordered_5fmap_69',['debug/unordered_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17333.html',1,'']]], - ['debug_2funordered_5fset_70',['debug/unordered_set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17342.html',1,'']]], - ['debug_2fvector_71',['debug/vector',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17354.html',1,'']]], - ['debug_5fallocator_72',['debug_allocator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10367.html',1,'__gnu_cxx']]], - ['debug_5fallocator_2eh_73',['debug_allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01046.html',1,'']]], - ['debug_5fmap_5fbase_2ehpp_74',['debug_map_base.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01145.html',1,'']]], - ['debug_5fmode_2ehpp_75',['debug_mode.hpp',['https://docs.opencv.org/4.2.0/d1/d9f/debug__mode_8hpp.html',1,'']]], - ['debugdmatch_76',['debugDMatch',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga68668c8dddd147c90070efa600c6d0ac',1,'cvv::debugDMatch(cv::InputArray img1, std::vector< cv::KeyPoint > keypoints1, cv::InputArray img2, std::vector< cv::KeyPoint > keypoints2, std::vector< cv::DMatch > matches, const impl::CallMetaData &data, const char *description=nullptr, const char *view=nullptr, bool useTrainDescriptor=true)'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga1a4749f275c79094d8db4825abe2cff7',1,'cvv::debugDMatch(cv::InputArray img1, std::vector< cv::KeyPoint > keypoints1, cv::InputArray img2, std::vector< cv::KeyPoint > keypoints2, std::vector< cv::DMatch > matches, const impl::CallMetaData &data, const std::string &description, const std::string &view, bool useTrainDescriptor=true)'],['https://docs.opencv.org/4.2.0/d7/d84/namespacecvv_1_1impl.html#a6dfa7a2f61782d810340ba5afe3205c9',1,'cvv::impl::debugDMatch()']]], - ['debugfilter_77',['debugFilter',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga7fcba850f6ecb852203e5622a37c3bc6',1,'cvv::debugFilter(cv::InputArray original, cv::InputArray result, impl::CallMetaData metaData=impl::CallMetaData(), const char *description=nullptr, const char *view=nullptr)'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga9ddffb4d96ca0b4dd47ae94bedc6def7',1,'cvv::debugFilter(cv::InputArray original, cv::InputArray result, impl::CallMetaData metaData, const ::std::string &description, const ::std::string &view="")'],['https://docs.opencv.org/4.2.0/d7/d84/namespacecvv_1_1impl.html#a81d0d251c62351b2f9372074d1303f8a',1,'cvv::impl::debugFilter()']]], - ['debugger_78',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['debugging_20of_20computer_20vision_20applications_79',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], - ['debugging_20of_20computer_20vision_20programs_80',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], - ['debugmode_81',['debugMode',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga1669e90a1a521eebc7c61a694bba2927',1,'cvv']]], - ['dec_82',['dec',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'basic_ios< char, _Traits >::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'basic_iostream< char >::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'basic_istream< char >::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'basic_istream< char, _Traits >::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'basic_ostream< char >::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'basic_ostream< char, _Traits >::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_fstream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_ifstream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_ios::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_iostream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_istream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_istringstream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_ofstream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_ostream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_ostringstream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_stringstream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::ios_base::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a41ca573b6c90740c9355d373118d87f5',1,'std::dec(ios_base &__base)']]], - ['decay_83',['decay',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04231.html',1,'std']]], - ['decay_5ft_84',['decay_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#gabe26c12710bb4c683badfaf0a586c5be',1,'std::decay_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#gabe26c12710bb4c683badfaf0a586c5be',1,'decay_t(Global Namespace)']]], - ['decim_85',['decim',['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html#ad9b2878242df9ef65d1c4243e5c25f10',1,'cv::gapi::wip::draw::Mosaic']]], - ['decimal_86',['decimal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00998.html',1,'']]], - ['decimal_20floating_20point_20arithmetic_87',['Decimal Floating-Point Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01520.html',1,'']]], - ['decimal128_88',['decimal128',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09831.html',1,'std::decimal::decimal128'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09831.html#a0109f8036769986ae2b5cbb5b369b1fc',1,'std::decimal::decimal128::decimal128()']]], - ['decimal32_89',['decimal32',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09823.html',1,'std::decimal::decimal32'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09823.html#a0a56ec8df48bee17d6c22c53c0f160f8',1,'std::decimal::decimal32::decimal32()']]], - ['decimal32_5fto_5flong_5flong_90',['decimal32_to_long_long',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01584.html#a382d300aa924d2e205ddca22d677dcec',1,'std::decimal']]], - ['decimal64_91',['decimal64',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09827.html',1,'std::decimal::decimal64'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09827.html#afc30d8fb426619b5f29cf8b590c6b331',1,'std::decimal::decimal64::decimal64()']]], - ['decimal_5fpoint_92',['decimal_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a65fe46d62bb27b85e80b291d164193e1',1,'std::moneypunct::decimal_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a65fe46d62bb27b85e80b291d164193e1',1,'std::moneypunct_byname::decimal_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a77a3bcc91f7435d9a38705d681fc9189',1,'std::numpunct::decimal_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a77a3bcc91f7435d9a38705d681fc9189',1,'std::numpunct_byname::decimal_point()']]], - ['decode_93',['decode',['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a4172c2eb4825c844fb1b0ae67202d329',1,'cv::QRCodeDetector::decode()'],['https://docs.opencv.org/4.2.0/d9/dbb/classcv_1_1structured__light_1_1StructuredLightPattern.html#a4cc409edf8a330eeccba6737d391da34',1,'cv::structured_light::StructuredLightPattern::decode()']]], - ['decode_20gray_20code_20pattern_20tutorial_94',['Decode Gray code pattern tutorial',['https://docs.opencv.org/4.2.0/dc/da9/tutorial_decode_graycode_pattern.html',1,'']]], - ['decode_5f3d_5funderworld_95',['DECODE_3D_UNDERWORLD',['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html#gga8c656fa76189bd6dc1b2a444f680b60aa98f0a8c890dded38d226722bcdd5795c',1,'cv::structured_light::DECODE_3D_UNDERWORLD'],['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html#gga8c656fa76189bd6dc1b2a444f680b60aa98f0a8c890dded38d226722bcdd5795c',1,'DECODE_3D_UNDERWORLD(Global Namespace)']]], - ['decodeparameters_96',['decodeParameters',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a1ce3447b0344cfade75947e2fe0e6914',1,'cv::omnidir::internal']]], - ['decodeparametersstereo_97',['decodeParametersStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#abd67a34e9f9f1e1fb27afa5b7762b333',1,'cv::omnidir::internal']]], - ['decoder_5fmode_98',['decoder_mode',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gac013d7b1a6a1b7d739b89474c20ec086',1,'cv::text::decoder_mode'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gac013d7b1a6a1b7d739b89474c20ec086',1,'decoder_mode(Global Namespace)']]], - ['decoding_99',['Video Encoding/Decoding',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html',1,'']]], - ['decolor_100',['decolor',['https://docs.opencv.org/4.2.0/d4/d32/group__photo__decolor.html#ga4864d4c007bda5dacdc5e9d4ed7e222c',1,'cv::decolor()'],['https://docs.opencv.org/4.2.0/d4/d32/group__photo__decolor.html#ga4864d4c007bda5dacdc5e9d4ed7e222c',1,'decolor(InputArray src, OutputArray grayscale, OutputArray color_boost)(Global Namespace)']]], - ['decolorization_101',['Contrast Preserving Decolorization',['https://docs.opencv.org/4.2.0/d4/d32/group__photo__decolor.html',1,'']]], - ['decomp_5fcholesky_102',['DECOMP_CHOLESKY',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca33cf860f98004310374a81d2c01715da',1,'cv::DECOMP_CHOLESKY'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca33cf860f98004310374a81d2c01715da',1,'DECOMP_CHOLESKY(Global Namespace)']]], - ['decomp_5feig_103',['DECOMP_EIG',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca3fc1b148b39f0ca4ac5fc6e0f1b7198b',1,'cv::DECOMP_EIG'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca3fc1b148b39f0ca4ac5fc6e0f1b7198b',1,'DECOMP_EIG(Global Namespace)']]], - ['decomp_5flu_104',['DECOMP_LU',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca247a3455cd64973152e17e26999dc024',1,'cv::DECOMP_LU'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca247a3455cd64973152e17e26999dc024',1,'DECOMP_LU(Global Namespace)']]], - ['decomp_5fnormal_105',['DECOMP_NORMAL',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca13eaae0241295166140291223db12166',1,'cv::DECOMP_NORMAL'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca13eaae0241295166140291223db12166',1,'DECOMP_NORMAL(Global Namespace)']]], - ['decomp_5fqr_106',['DECOMP_QR',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674cab086be5a080138d7db9b11dab378d845',1,'cv::DECOMP_QR'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674cab086be5a080138d7db9b11dab378d845',1,'DECOMP_QR(Global Namespace)']]], - ['decomp_5fsvd_107',['DECOMP_SVD',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca523b676c90c7a1d2841b1267ba9ba614',1,'cv::DECOMP_SVD'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca523b676c90c7a1d2841b1267ba9ba614',1,'DECOMP_SVD(Global Namespace)']]], - ['decomposeessentialmat_108',['decomposeEssentialMat',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga54a2f5b3f8aeaf6c76d4a31dece85d5d',1,'cv::decomposeEssentialMat()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga54a2f5b3f8aeaf6c76d4a31dece85d5d',1,'decomposeEssentialMat()(Global Namespace)']]], - ['decomposehomographymat_109',['decomposeHomographyMat',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga7f60bdff78833d1e3fd6d9d0fd538d92',1,'cv::decomposeHomographyMat()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga7f60bdff78833d1e3fd6d9d0fd538d92',1,'decomposeHomographyMat()(Global Namespace)']]], - ['decomposeprojectionmatrix_110',['decomposeProjectionMatrix',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaaae5a7899faa1ffdf268cd9088940248',1,'cv::decomposeProjectionMatrix()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaaae5a7899faa1ffdf268cd9088940248',1,'decomposeProjectionMatrix(InputArray projMatrix, OutputArray cameraMatrix, OutputArray rotMatrix, OutputArray transVect, OutputArray rotMatrixX=noArray(), OutputArray rotMatrixY=noArray(), OutputArray rotMatrixZ=noArray(), OutputArray eulerAngles=noArray())(Global Namespace)']]], - ['decomposition_111',['decomposition',['https://docs.opencv.org/4.2.0/d8/d0e/group__core__hal__interface__decomp__cholesky.html',1,'Cholesky matrix decomposition'],['https://docs.opencv.org/4.2.0/d5/d42/group__core__hal__interface__decomp__lu.html',1,'LU matrix decomposition'],['https://docs.opencv.org/4.2.0/db/d36/group__core__hal__interface__decomp__qr.html',1,'QR matrix decomposition'],['https://docs.opencv.org/4.2.0/dd/d2a/group__core__hal__interface__decomp__svd.html',1,'Singular value matrix decomposition']]], - ['decompositionoptions_112',['DecompositionOptions',['https://eigen.tuxfamily.org/dox/group__enums.html#gae3e239fb70022eb8747994cf5d68b4a9',1,'Eigen::DecompositionOptions'],['https://eigen.tuxfamily.org/dox/group__enums.html#gae3e239fb70022eb8747994cf5d68b4a9',1,'DecompositionOptions(Global Namespace)']]], - ['decompositions_113',['decompositions',['https://eigen.tuxfamily.org/dox/group__DenseDecompositionBenchmark.html',1,'Benchmark of dense decompositions'],['https://eigen.tuxfamily.org/dox/group__TopicLinearAlgebraDecompositions.html',1,'Catalogue of dense decompositions'],['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'Dense linear problems and decompositions'],['https://eigen.tuxfamily.org/dox/group__InplaceDecomposition.html',1,'Inplace matrix decompositions'],['https://eigen.tuxfamily.org/dox/group__TutorialLinearAlgebra.html',1,'Linear algebra and decompositions']]], - ['decomptypes_114',['DecompTypes',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaaf9ea5dcc392d5ae04eacb9920b9674c',1,'cv::DecompTypes'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaaf9ea5dcc392d5ae04eacb9920b9674c',1,'DecompTypes(Global Namespace)']]], - ['deconvolutionlayer_115',['DeconvolutionLayer',['https://docs.opencv.org/4.2.0/dd/d77/classcv_1_1dnn_1_1DeconvolutionLayer.html',1,'cv::dnn']]], - ['deep_20learning_20layers_20support_116',['Custom deep learning layers support',['https://docs.opencv.org/4.2.0/dc/db1/tutorial_dnn_custom_layers.html',1,'']]], - ['deep_20networks_20in_20browser_117',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], - ['deep_20networks_20on_20android_20device_118',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], - ['deep_20neural_20network_20module_119',['Deep Neural Network module',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html',1,'']]], - ['deep_20neural_20networks_20dnn_20module_120',['Deep Neural Networks (dnn module)',['https://docs.opencv.org/4.2.0/d2/d58/tutorial_table_of_content_dnn.html',1,'']]], - ['default_121',['DEFAULT',['https://docs.opencv.org/4.2.0/d8/d6f/structcv_1_1line__descriptor_1_1DrawLinesMatchesFlags.html#af77f9b45585f16821d7a06ea38909e68a2e8e234416ae60a082f9078f3b4ff083',1,'cv::line_descriptor::DrawLinesMatchesFlags::DEFAULT'],['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa912544338415c5f8c8e55e85a139bfbadc617558c0a38a21d08622aba3ea6ab3',1,'cv::cuda::Event::DEFAULT'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a5b39c8b553c821e7cddc6da64b5bd2ee',1,'DEFAULT(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a5b39c8b553c821e7cddc6da64b5bd2ee',1,'DEFAULT(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a5b39c8b553c821e7cddc6da64b5bd2ee',1,'DEFAULT(Global Namespace)']]], - ['default2dmotion_122',['default2dMotion',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#a30dc41affb537f4c8af23bebc18defa1',1,'cv::videostab::RansacParams']]], - ['default_5fcomb_5fhash_5ffn_123',['default_comb_hash_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11463.html',1,'__gnu_pbds::detail']]], - ['default_5fdelete_124',['default_delete',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07995.html',1,'std::default_delete< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07995.html#a304c2d88d632c1023b5cf06066d18440',1,'std::default_delete::default_delete() noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07995.html#a91c7d2434b31fc4d62155d108d1bfd99',1,'std::default_delete::default_delete(const default_delete< _Up > &) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07999.html#a8add7bace07168095265e2cbe19cd3fe',1,'std::default_delete< _Tp[]>::default_delete() noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07999.html#aec0bac655768abe7060853f80292614f',1,'std::default_delete< _Tp[]>::default_delete(const default_delete< _Up[]> &) noexcept']]], - ['default_5fdelete_3c_20_5ftp_5b_5d_3e_125',['default_delete< _Tp[]>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07999.html',1,'std']]], - ['default_5feq_5ffn_126',['default_eq_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11459.html',1,'__gnu_pbds::detail']]], - ['default_5fhash_5ffn_127',['default_hash_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11455.html',1,'__gnu_pbds::detail']]], - ['default_5fmax_5fdepth_128',['DEFAULT_MAX_DEPTH',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#ab9b0710c56e1ba0d861a16cae2000c78',1,'cv::rgbd::Odometry']]], - ['default_5fmax_5fdepth_5fdiff_129',['DEFAULT_MAX_DEPTH_DIFF',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#ace1301318716355d12586c3028e84e1e',1,'cv::rgbd::Odometry']]], - ['default_5fmax_5fiters_130',['DEFAULT_MAX_ITERS',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a4af5b1a72ec68db46d5199d63a983d83a1e62e599654778422db115bccb56c40a',1,'cv::ml::EM']]], - ['default_5fmax_5fpoints_5fpart_131',['DEFAULT_MAX_POINTS_PART',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a9a301d39d2dd32519ac1b6f8cfefc358',1,'cv::rgbd::Odometry']]], - ['default_5fmax_5frotation_132',['DEFAULT_MAX_ROTATION',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a47b0d3af975ec11c285bb544d54b3720',1,'cv::rgbd::Odometry']]], - ['default_5fmax_5ftranslation_133',['DEFAULT_MAX_TRANSLATION',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a6a08d1b708ab5de096df80d90f9029b6',1,'cv::rgbd::Odometry']]], - ['default_5fmin_5fdepth_134',['DEFAULT_MIN_DEPTH',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a4f7854bd4c50808fbb1328c8faba4023',1,'cv::rgbd::Odometry']]], - ['default_5fnclusters_135',['DEFAULT_NCLUSTERS',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a4af5b1a72ec68db46d5199d63a983d83a19593ad7143e258ab5f7cb0174f3403a',1,'cv::ml::EM']]], - ['default_5fnlevels_136',['DEFAULT_NLEVELS',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a1e9057ce853bfbdf4e43cea380396d37a00a697fa3ad742792128a39785a60ed2',1,'cv::HOGDescriptor']]], - ['default_5fparallel_5ftag_137',['default_parallel_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09711.html',1,'__gnu_parallel']]], - ['default_5fprobe_5ffn_138',['default_probe_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11475.html',1,'__gnu_pbds::detail']]], - ['default_5fresize_5fpolicy_139',['default_resize_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11467.html',1,'__gnu_pbds::detail']]], - ['default_5fstep_140',['default_step',['https://docs.opencv.org/4.2.0/d0/d06/namespacecv_1_1gapi_1_1own_1_1detail.html#aafeec5427533d638f2f8437397363899',1,'cv::gapi::own::detail']]], - ['default_5ftrie_5faccess_5ftraits_141',['default_trie_access_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11479.html',1,'__gnu_pbds::detail']]], - ['default_5ftrie_5faccess_5ftraits_3c_20std_3a_3abasic_5fstring_3c_20char_2c_20char_5ftraits_2c_20std_3a_3aallocator_3c_20char_20_3e_20_3e_20_3e_142',['default_trie_access_traits< std::basic_string< Char, Char_Traits, std::allocator< char > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11483.html',1,'__gnu_pbds::detail']]], - ['default_5fupdate_5fpolicy_143',['default_update_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11471.html',1,'__gnu_pbds::detail']]], - ['defaultallocator_144',['defaultAllocator',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ad3e0ed263377f0989c3490f3d496a201',1,'cv::cuda::GpuMat']]], - ['defaultavcapturedeviceposition_145',['defaultAVCaptureDevicePosition',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a038fae0411c8b8fe316c27287a00f745',1,'CvAbstractCamera']]], - ['defaultavcapturesessionpreset_146',['defaultAVCaptureSessionPreset',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a53a3585adb702512e86023aee31607e5',1,'CvAbstractCamera']]], - ['defaultavcapturevideoorientation_147',['defaultAVCaptureVideoOrientation',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a3190de91139b32e8bf15d47e8a75e97d',1,'CvAbstractCamera']]], - ['defaultcopypolicy_148',['DefaultCopyPolicy',['https://docs.opencv.org/4.2.0/d8/dc2/structcv_1_1cudev_1_1DefaultCopyPolicy.html',1,'cv::cudev']]], - ['defaultdeleter_3c_20cvcapture_20_3e_149',['DefaultDeleter< CvCapture >',['https://docs.opencv.org/4.2.0/d0/d90/structcv_1_1DefaultDeleter_3_01CvCapture_01_4.html',1,'cv']]], - ['defaultdeleter_3c_20cvhaarclassifiercascade_20_3e_150',['DefaultDeleter< CvHaarClassifierCascade >',['https://docs.opencv.org/4.2.0/d9/ddf/structcv_1_1DefaultDeleter_3_01CvHaarClassifierCascade_01_4.html',1,'cv']]], - ['defaultdeleter_3c_20cvvideowriter_20_3e_151',['DefaultDeleter< CvVideoWriter >',['https://docs.opencv.org/4.2.0/d2/d37/structcv_1_1DefaultDeleter_3_01CvVideoWriter_01_4.html',1,'cv']]], - ['defaultdeviceinitializer_152',['DefaultDeviceInitializer',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#ab98d52cf0377206238fa449eebe36ab9',1,'cv::cuda::Stream']]], - ['defaultdir_153',['defaultDir',['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#ab49b384f6be30177f811cb7ae0c81406',1,'cv::ml::DTrees::Node']]], - ['defaultfloat_154',['defaultfloat',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a74ba205196abe11761ff1c8016d6b5df',1,'std']]], - ['defaultfps_155',['defaultFPS',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a4191912661631d746270dc24a0b9a902',1,'CvAbstractCamera']]], - ['defaultglobreducepolicy_156',['DefaultGlobReducePolicy',['https://docs.opencv.org/4.2.0/d2/d04/structcv_1_1cudev_1_1DefaultGlobReducePolicy.html',1,'cv::cudev']]], - ['defaulthistogrampolicy_157',['DefaultHistogramPolicy',['https://docs.opencv.org/4.2.0/d4/d2b/structcv_1_1cudev_1_1DefaultHistogramPolicy.html',1,'cv::cudev']]], - ['defaultnorm_158',['defaultNorm',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a934a22d5f2277347623e355d8a4b8d0e',1,'cv::line_descriptor::BinaryDescriptor::defaultNorm()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a90e93108d3d7ffdf21889a2f1aa1faa8',1,'cv::Feature2D::defaultNorm()'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a2309d119986eadf6ee099ad5bf78ed98',1,'cv::cuda::SURF_CUDA::defaultNorm()']]], - ['defaultparams_159',['defaultParams',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#ac3fdcd26d5141bbc2d6e0ded9faf5bc0',1,'cv::dynafu::Params::defaultParams()'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#aef7f84e8deb0ee8272ee861d084fcb11',1,'cv::kinfu::Params::defaultParams()']]], - ['defaultreducetovecpolicy_160',['DefaultReduceToVecPolicy',['https://docs.opencv.org/4.2.0/d3/dd7/structcv_1_1cudev_1_1DefaultReduceToVecPolicy.html',1,'cv::cudev']]], - ['defaultsplitmergepolicy_161',['DefaultSplitMergePolicy',['https://docs.opencv.org/4.2.0/d9/d3a/structcv_1_1cudev_1_1DefaultSplitMergePolicy.html',1,'cv::cudev']]], - ['defaulttransformpolicy_162',['DefaultTransformPolicy',['https://docs.opencv.org/4.2.0/db/db3/structcv_1_1cudev_1_1DefaultTransformPolicy.html',1,'cv::cudev']]], - ['defaulttransposepolicy_163',['DefaultTransposePolicy',['https://docs.opencv.org/4.2.0/dd/d44/structcv_1_1cudev_1_1DefaultTransposePolicy.html',1,'cv::cudev']]], - ['defer_5flock_164',['defer_lock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga70a73adf8c062ea682cd99580d0a39be',1,'std::defer_lock'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga70a73adf8c062ea682cd99580d0a39be',1,'defer_lock(Global Namespace)']]], - ['defer_5flock_5ft_165',['defer_lock_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07195.html',1,'std']]], - ['deferred_166',['deferred',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4a43fff3df3fc0b3417c86dc3040fb2d86',1,'deferred(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5ba43fff3df3fc0b3417c86dc3040fb2d86',1,'deferred(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4a43fff3df3fc0b3417c86dc3040fb2d86',1,'deferred(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5ba43fff3df3fc0b3417c86dc3040fb2d86',1,'deferred(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4a43fff3df3fc0b3417c86dc3040fb2d86',1,'deferred(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5ba43fff3df3fc0b3417c86dc3040fb2d86',1,'deferred(Global Namespace)']]], - ['defines_2eh_167',['defines.h',['https://docs.opencv.org/4.2.0/d8/db0/defines_8h.html',1,'']]], - ['deformable_20part_20based_20models_168',['Deformable Part-based Models',['https://docs.opencv.org/4.2.0/d9/d12/group__dpm.html',1,'']]], - ['degree_169',['DEGREE',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3a61a897bf6519f4be834ce379a1543869',1,'cv::ml::SVM']]], - ['delegate_170',['delegate',['https://docs.opencv.org/4.2.0/d4/d1d/interfaceCvPhotoCamera.html#a7198da91a6278007ffa227ed1ae0bdc4',1,'CvPhotoCamera::delegate'],['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#a34e036fdee24dcf4e0ca57e938b77cbd',1,'CvVideoCamera::delegate']]], - ['deletedatainstance_171',['deleteDataInstance',['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#a6a197810db6d03c4397ee203eb9a2fad',1,'cv::TLSData::deleteDataInstance()'],['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#a6a197810db6d03c4397ee203eb9a2fad',1,'TLSData< cv::instr::NodeDataTls >::deleteDataInstance()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#accf3a284d5358bcd39aab9df897fa206',1,'cv::TLSDataAccumulator::deleteDataInstance()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#accf3a284d5358bcd39aab9df897fa206',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::deleteDataInstance()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#ab9969d79ef0b1acb9e26548a283e1059',1,'cv::TLSDataContainer::deleteDataInstance()']]], - ['deleteedge_172',['deleteEdge',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aab7fdb247262a8ffb638e745c9faed06',1,'cv::Subdiv2D']]], - ['deletepoint_173',['deletePoint',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a78dfd541b7d8eb856b360189ac1a3912',1,'cv::Subdiv2D']]], - ['delta_174',['delta',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#ab5e69103deaefe02cb3dbcee713b12b8',1,'cv::cuda::FGDParams']]], - ['demosaicing_175',['demosaicing',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga57261f12fccf872a2b2d66daf29d5bd0',1,'cv::demosaicing()'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga7fb153572b573ebd2d7610fcbe64166e',1,'cv::cuda::demosaicing()'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga57261f12fccf872a2b2d66daf29d5bd0',1,'demosaicing(InputArray src, OutputArray dst, int code, int dstCn=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga7fb153572b573ebd2d7610fcbe64166e',1,'demosaicing(InputArray src, OutputArray dst, int code, int dcn=-1, Stream &stream=Stream::Null())(Global Namespace)']]], - ['demosaictypes_176',['DemosaicTypes',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gaa9e40b798350356f45667e609d5d82f9',1,'cv::cuda::DemosaicTypes'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gaa9e40b798350356f45667e609d5d82f9',1,'DemosaicTypes(Global Namespace)']]], - ['denoise_5ftvl1_177',['denoise_TVL1',['https://docs.opencv.org/4.2.0/d1/d79/group__photo__denoise.html#ga7602ed5ae17b7de40152b922227c4e4f',1,'cv::denoise_TVL1()'],['https://docs.opencv.org/4.2.0/d1/d79/group__photo__denoise.html#ga7602ed5ae17b7de40152b922227c4e4f',1,'denoise_TVL1(const std::vector< Mat > &observations, Mat &result, double lambda=1.0, int niters=30)(Global Namespace)']]], - ['denoising_178',['Denoising',['https://docs.opencv.org/4.2.0/d1/d79/group__photo__denoise.html',1,'Denoising'],['https://docs.opencv.org/4.2.0/d5/d69/tutorial_py_non_local_means.html',1,'Image Denoising']]], - ['denorm_5fabsent_179',['denorm_absent',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d4e3dd02abab45dde95b5bb4ae7fdbfad91095a64f12657bc911d2cecd4fab0d',1,'std']]], - ['denorm_5findeterminate_180',['denorm_indeterminate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d4e3dd02abab45dde95b5bb4ae7fdbfa33fdcd73e760174c19ab87389eb104ae',1,'std']]], - ['denorm_5fmin_181',['denorm_min',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#ab1f0b8ed143b9669ed2552db8dc84948',1,'std::numeric_limits']]], - ['denorm_5fpresent_182',['denorm_present',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d4e3dd02abab45dde95b5bb4ae7fdbfa28c4fcc178853e4c66190bc2c5027de5',1,'std']]], - ['dense_183',['Dense',['https://eigen.tuxfamily.org/dox/structEigen_1_1Dense.html',1,'Eigen']]], - ['dense_20decompositions_184',['dense decompositions',['https://eigen.tuxfamily.org/dox/group__DenseDecompositionBenchmark.html',1,'Benchmark of dense decompositions'],['https://eigen.tuxfamily.org/dox/group__TopicLinearAlgebraDecompositions.html',1,'Catalogue of dense decompositions']]], - ['dense_20linear_20problems_20and_20decompositions_185',['Dense linear problems and decompositions',['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'']]], - ['dense_20matrix_20and_20array_20manipulation_186',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], - ['dense_20stereo_187',['Quasi dense Stereo',['https://docs.opencv.org/4.2.0/d7/d5a/tutorial_qds_quasi_dense_stereo.html',1,'']]], - ['dense_20stereo_20stereo_20module_188',['Quasi Dense Stereo (stereo module)',['https://docs.opencv.org/4.2.0/d9/d58/tutorial_table_of_content_quasi_dense_stereo.html',1,'']]], - ['dense_5fxpr_5fbase_5fdispatcher_189',['dense_xpr_base_dispatcher',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'Eigen::doxygen']]], - ['dense_5fxpr_5fbase_5fdispatcher_3c_20array_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_190',['dense_xpr_base_dispatcher< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher_3_01Array_3_01__Scalar_00_01__Rows_00_01_9f66d076f8f04907f9f0093247d3c377.html',1,'Eigen::doxygen']]], - ['dense_5fxpr_5fbase_5fdispatcher_3c_20array_3c_20double_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_191',['dense_xpr_base_dispatcher< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], - ['dense_5fxpr_5fbase_5fdispatcher_3c_20array_3c_20index_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_192',['dense_xpr_base_dispatcher< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], - ['dense_5fxpr_5fbase_5fdispatcher_3c_20array_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_193',['dense_xpr_base_dispatcher< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], - ['dense_5fxpr_5fbase_5fdispatcher_3c_20array_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_194',['dense_xpr_base_dispatcher< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], - ['dense_5fxpr_5fbase_5fdispatcher_3c_20array_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_195',['dense_xpr_base_dispatcher< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], - ['dense_5fxpr_5fbase_5fdispatcher_3c_20matrix_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_196',['dense_xpr_base_dispatcher< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher_3_01Matrix_3_01__Scalar_00_01__Rows_00_0116fa1ae814876cf66b62915b437740e6.html',1,'Eigen::doxygen']]], - ['dense_5fxpr_5fbase_5fdispatcher_3c_20matrix_3c_20complexscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_197',['dense_xpr_base_dispatcher< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], - ['dense_5fxpr_5fbase_5fdispatcher_3c_20matrix_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_198',['dense_xpr_base_dispatcher< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], - ['dense_5fxpr_5fbase_5fdispatcher_3c_20matrix_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_199',['dense_xpr_base_dispatcher< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], - ['dense_5fxpr_5fbase_5fdispatcher_3c_20matrix_3c_20scalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_200',['dense_xpr_base_dispatcher< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], - ['dense_5fxpr_5fbase_5fdispatcher_3c_20matrix_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_201',['dense_xpr_base_dispatcher< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], - ['densebase_202',['DenseBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html',1,'Eigen::DenseBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa284042d0e1b0ad9b6a00db7fd2d9f7f',1,'Eigen::DenseBase::DenseBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa284042d0e1b0ad9b6a00db7fd2d9f7f',1,'DenseBase< ArrayWrapper< ExpressionType > >::DenseBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa284042d0e1b0ad9b6a00db7fd2d9f7f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::DenseBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa284042d0e1b0ad9b6a00db7fd2d9f7f',1,'DenseBase< Solve< Decomposition, RhsType > >::DenseBase()']]], - ['densebase_3c_20arraywrapper_3c_20expressiontype_20_3e_20_3e_203',['DenseBase< ArrayWrapper< ExpressionType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html',1,'']]], - ['densebase_3c_20homogeneous_3c_20matrixtype_2c_20_5fdirection_20_3e_20_3e_204',['DenseBase< Homogeneous< MatrixType, _Direction > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html',1,'']]], - ['densebase_3c_20solve_3c_20decomposition_2c_20rhstype_20_3e_20_3e_205',['DenseBase< Solve< Decomposition, RhsType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html',1,'']]], - ['densecoeffsbase_3c_20derived_2c_20directaccessors_20_3e_206',['DenseCoeffsBase< Derived, DirectAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html',1,'Eigen']]], - ['densecoeffsbase_3c_20derived_2c_20directwriteaccessors_20_3e_207',['DenseCoeffsBase< Derived, DirectWriteAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html',1,'Eigen']]], - ['densecoeffsbase_3c_20derived_2c_20readonlyaccessors_20_3e_208',['DenseCoeffsBase< Derived, ReadOnlyAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html',1,'Eigen']]], - ['densecoeffsbase_3c_20derived_2c_20writeaccessors_20_3e_209',['DenseCoeffsBase< Derived, WriteAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html',1,'Eigen']]], - ['denseopticalflow_210',['DenseOpticalFlow',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1cuda_1_1DenseOpticalFlow.html',1,'cv::cuda::DenseOpticalFlow'],['https://docs.opencv.org/4.2.0/df/dde/classcv_1_1DenseOpticalFlow.html',1,'cv::DenseOpticalFlow']]], - ['denseopticalflowext_211',['DenseOpticalFlowExt',['https://docs.opencv.org/4.2.0/d1/d21/classcv_1_1superres_1_1DenseOpticalFlowExt.html',1,'cv::superres']]], - ['densepyrlkopticalflow_212',['DensePyrLKOpticalFlow',['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1cuda_1_1DensePyrLKOpticalFlow.html',1,'cv::cuda']]], - ['denserlofopticalflow_213',['DenseRLOFOpticalFlow',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html',1,'cv::optflow']]], - ['densities_214',['densities',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a0269fcd857f0706a223f87155a3ff725',1,'std::piecewise_constant_distribution::densities()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#ae5a24184d9ada6b028d1bdc5555f5dbb',1,'std::piecewise_linear_distribution::densities()']]], - ['density_5fth_215',['density_th',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#a38490002643fee2bdf18c855e7ec02fa',1,'cv::line_descriptor::LSDParam']]], - ['densityneighborhoodsize_216',['densityNeighborhoodSize',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a9f79d2b1d49d869392f84d795d8137ba',1,'cv::CirclesGridFinderParameters']]], - ['dep_217',['dep',['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#aa20cc45779278c7f3c74b3c86f30c294',1,'cv::datasets::GR_skigObj']]], - ['depth_218',['depth',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a8ff44429b7c0b89c3f316fa76454da5a',1,'cv::GMatDesc::depth'],['https://docs.opencv.org/4.2.0/d3/dad/structcv_1_1datasets_1_1GR__chalearnObj.html#a7f4f6af840c97f7de852ec6bc9f5629c',1,'cv::datasets::GR_chalearnObj::depth'],['https://docs.opencv.org/4.2.0/d0/db6/structcv_1_1datasets_1_1OR__pascalObj.html#a74c850cbeccf31a5e85df42648637e75',1,'cv::datasets::OR_pascalObj::depth'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1datasets_1_1PD__inriaObj.html#a1e4a5a3b168e26e4c24bf6764f2490b1',1,'cv::datasets::PD_inriaObj::depth'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#acc9d7572731ae8bdbcbfd0423b5cb536',1,'cv::rgbd::RgbdFrame::depth'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a30d20f67815668353be5644725f78dfa',1,'cv::_InputArray::depth()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a4e9be9d9d7a99d1c12d1469ab7c35eee',1,'cv::ogl::Buffer::depth()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#aaa229d9b2b2f60ecae3b5fbf0603c1b9',1,'cv::cuda::GpuMat::depth()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#aec2636a0d4065f56f55373a7507c8b3c',1,'cv::cudev::GpuMat_::depth()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a1cb85c2b9f858bbc892b1dd282eba3c4',1,'cv::cuda::HostMem::depth()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a8da9f853b6f3a29d738572fd1ffc44c0',1,'cv::Mat::depth()'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#ac17970b7962e231610288a8b0f035161',1,'cv::gapi::own::Mat::depth()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ad1a85fe520ae0a75b8151a85cb1a616c',1,'cv::Mat_::depth()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ad1a85fe520ae0a75b8151a85cb1a616c',1,'Mat_< double >::depth()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ad1a85fe520ae0a75b8151a85cb1a616c',1,'Mat_< float >::depth()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ad1a85fe520ae0a75b8151a85cb1a616c',1,'Mat_< uchar >::depth()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ad1a85fe520ae0a75b8151a85cb1a616c',1,'Mat_< unsigned char >::depth()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ae40e39e851f00341f1df57cb482429dc',1,'cv::SparseMat::depth()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#adebe30e83d0c876a63de558ca3ab5435',1,'cv::SparseMat_::depth()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a8511e27bd0093e5dd236df1ef111087a',1,'cv::UMat::depth()'],['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#ga8b5e5413af41caf3f2a0bbf4cdf517a8',1,'cv::sfm::depth()'],['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#ga8b5e5413af41caf3f2a0bbf4cdf517a8',1,'depth(InputArray R, InputArray t, InputArray X)(Global Namespace)']]], - ['depth_20map_20from_20stereo_20images_219',['Depth Map from Stereo Images',['https://docs.opencv.org/4.2.0/dd/d53/tutorial_py_depthmap.html',1,'']]], - ['depth_20processing_220',['RGB-Depth Processing',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html',1,'']]], - ['depth_20sensors_221',['depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors'],['https://docs.opencv.org/4.2.0/d7/d6f/tutorial_kinect_openni.html',1,'Using Kinect and other OpenNI compatible depth sensors']]], - ['depth_2ehpp_222',['depth.hpp',['https://docs.opencv.org/4.2.0/db/d30/depth_8hpp.html',1,'']]], - ['depth_5f_223',['depth_',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a72caa32478e3272b39acce343d0a977d',1,'cv::rgbd::DepthCleaner::depth_'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#adcac1dbf126ec619a8f1b537b1243db7',1,'cv::rgbd::RgbdNormals::depth_']]], - ['depth_5fcleaner_5fimpl_5f_224',['depth_cleaner_impl_',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#ac796d356aa15fd508d986698a1fd132d',1,'cv::rgbd::DepthCleaner']]], - ['depth_5fcleaner_5fmethod_225',['DEPTH_CLEANER_METHOD',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a09e7960316b2f21d6529aa3b937b6185',1,'cv::rgbd::DepthCleaner']]], - ['depth_5fcleaner_5fnil_226',['DEPTH_CLEANER_NIL',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a09e7960316b2f21d6529aa3b937b6185a1d090ec96f4560519c8d5f93693e3a08',1,'cv::rgbd::DepthCleaner']]], - ['depth_5fcomponent_227',['DEPTH_COMPONENT',['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1838399ee67c0957c0ae42cabfa99033ad97d2f204bb7e38b03b74ea3a8129cdb',1,'cv::ogl::Texture2D']]], - ['depth_5fmask_228',['DEPTH_MASK',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa6207c8cf9a3e442f153dc0241aea600a1454580da17d20c8ec5917170dc3da3a',1,'cv::Mat::DEPTH_MASK'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a253082dc73b6e195968b5cd6ad10c71bacbabb2648f797b89bd9ddc77cce0c408',1,'cv::UMat::DEPTH_MASK']]], - ['depth_5fmask_5f16f_229',['DEPTH_MASK_16F',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39ae6f2776fcc4735a6a62ba533b521cce6',1,'cv::_OutputArray']]], - ['depth_5fmask_5f16s_230',['DEPTH_MASK_16S',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39a12fc72b6ad6b7c4c57d43101418c7647',1,'cv::_OutputArray']]], - ['depth_5fmask_5f16u_231',['DEPTH_MASK_16U',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39a37e0a6be8e5e1348653da7afa4374c8a',1,'cv::_OutputArray']]], - ['depth_5fmask_5f32f_232',['DEPTH_MASK_32F',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39ad93b863667cd772d276cd79e5710ec7a',1,'cv::_OutputArray']]], - ['depth_5fmask_5f32s_233',['DEPTH_MASK_32S',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39ae45a3064f674f50ca7b2bbbd891d18db',1,'cv::_OutputArray']]], - ['depth_5fmask_5f64f_234',['DEPTH_MASK_64F',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39ad5a4d24690fc0c25e90caec2a89240d2',1,'cv::_OutputArray']]], - ['depth_5fmask_5f8s_235',['DEPTH_MASK_8S',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39aa632dc99a97d2f95b3e6859c4bcd7070',1,'cv::_OutputArray']]], - ['depth_5fmask_5f8u_236',['DEPTH_MASK_8U',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39add5f87e30d2774e03decfc24692f0a34',1,'cv::_OutputArray']]], - ['depth_5fmask_5fall_237',['DEPTH_MASK_ALL',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39a2fb202d5da299b24f4e532a59233159e',1,'cv::_OutputArray']]], - ['depth_5fmask_5fall_5f16f_238',['DEPTH_MASK_ALL_16F',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39a60b14ad36f03f8b3578e01f31c022e20',1,'cv::_OutputArray']]], - ['depth_5fmask_5fall_5fbut_5f8s_239',['DEPTH_MASK_ALL_BUT_8S',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39a79a72b5eaca571010cf9144b2d5ee795',1,'cv::_OutputArray']]], - ['depth_5fmask_5fflt_240',['DEPTH_MASK_FLT',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39a2c96709be1464f7d027955cfc59c22e4',1,'cv::_OutputArray']]], - ['depthcleaner_241',['DepthCleaner',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html',1,'cv::rgbd::DepthCleaner'],['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a0274dd5c53ffef6c22d3ff52c6912173',1,'cv::rgbd::DepthCleaner::DepthCleaner()'],['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#ad62ec7610e9eac63c0ab91f66ea9298e',1,'cv::rgbd::DepthCleaner::DepthCleaner(int depth, int window_size=5, int method=DepthCleaner::DEPTH_CLEANER_NIL)']]], - ['depthfactor_242',['depthFactor',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a6d7b0d32c20ccd1ad0e7ebb5fb59a164',1,'cv::dynafu::Params::depthFactor'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a29c1bbf7801359f77176433ee85bbfae',1,'cv::kinfu::Params::depthFactor']]], - ['depthmask_243',['DepthMask',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39',1,'cv::_OutputArray']]], - ['depthnormal_244',['DepthNormal',['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html',1,'cv::linemod::DepthNormal'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#aba19bc45db26d247e3f945eeeae4ea72',1,'cv::linemod::DepthNormal::DepthNormal()'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#ab396e6f6556c39a9e40d42bb6f5209d4',1,'cv::linemod::DepthNormal::DepthNormal(int distance_threshold, int difference_threshold, size_t num_features, int extract_threshold)']]], - ['depthto3d_245',['depthTo3d',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga403eeb581b09684f7e24f7c157086dd6',1,'cv::rgbd::depthTo3d()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga403eeb581b09684f7e24f7c157086dd6',1,'depthTo3d()(Global Namespace)']]], - ['depthto3dsparse_246',['depthTo3dSparse',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga76a9cadc808e7262f391d94fdc262b9e',1,'cv::rgbd::depthTo3dSparse()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga76a9cadc808e7262f391d94fdc262b9e',1,'depthTo3dSparse()(Global Namespace)']]], - ['depthtostring_247',['depthToString',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a5abb3fb83453e4b89ced1ec07bf9a313',1,'cv']]], - ['deque_248',['deque',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08839.html',1,'std::__debug::deque< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09107.html',1,'std::__profile::deque< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html',1,'std::deque< _Tp, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00062.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ae68c6ac05cd6e788a90c9b8a47c56756',1,'deque< _StateSeqT >::deque()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#aa8cf87c79a7c6bdf2cf07749fb1e2ff5',1,'deque< _StateSeqT >::deque(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a511a8f76d058f6bd0e2236abf8df23bc',1,'deque< _StateSeqT >::deque(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a858d7660a45a911f8ae7858246ea2f6d',1,'deque< _StateSeqT >::deque(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a03515a6af7f959e28cec591ac5f0f8b2',1,'deque< _StateSeqT >::deque(const deque &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a7d533f573a77a0f9bf33fa40dde1c9cd',1,'deque< _StateSeqT >::deque(deque &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0948ee096c5387c1deb1e5885d06c112',1,'deque< _StateSeqT >::deque(const deque &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0bb7da7a228f22622f2e822252813d51',1,'deque< _StateSeqT >::deque(deque &&__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#abdc5fd34432d73edde92643c58d7db6d',1,'deque< _StateSeqT >::deque(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ac11b72c35c99798a8aa8428206af7b74',1,'deque< _StateSeqT >::deque(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ae68c6ac05cd6e788a90c9b8a47c56756',1,'std::deque::deque()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#aa8cf87c79a7c6bdf2cf07749fb1e2ff5',1,'std::deque::deque(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a511a8f76d058f6bd0e2236abf8df23bc',1,'std::deque::deque(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a858d7660a45a911f8ae7858246ea2f6d',1,'std::deque::deque(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a03515a6af7f959e28cec591ac5f0f8b2',1,'std::deque::deque(const deque &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a7d533f573a77a0f9bf33fa40dde1c9cd',1,'std::deque::deque(deque &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0948ee096c5387c1deb1e5885d06c112',1,'std::deque::deque(const deque &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0bb7da7a228f22622f2e822252813d51',1,'std::deque::deque(deque &&__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#abdc5fd34432d73edde92643c58d7db6d',1,'std::deque::deque(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ac11b72c35c99798a8aa8428206af7b74',1,'std::deque::deque(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())']]], - ['deque_2etcc_249',['deque.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00320.html',1,'']]], - ['deque_3c_20_5fstateseqt_20_3e_250',['deque< _StateSeqT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html',1,'']]], - ['deque_3c_20std_3a_3apair_3c_20uint64_5ft_2c_20uint32_5ft_20_3e_20_3e_251',['deque< std::pair< uint64_t, uint32_t > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html',1,'std']]], - ['deque_3c_20trackedobject_20_3e_252',['deque< TrackedObject >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html',1,'std']]], - ['deriche_5ffilter_2ehpp_253',['deriche_filter.hpp',['https://docs.opencv.org/4.2.0/d4/d71/deriche__filter_8hpp.html',1,'']]], - ['deriv_2ehpp_254',['deriv.hpp',['https://docs.opencv.org/4.2.0/df/d27/expr_2deriv_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/da3/ptr2d_2deriv_8hpp.html',1,'(Global Namespace)']]], - ['derivaperture_255',['derivAperture',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a128efda1c45dee2a989547c7b41e6a95',1,'cv::HOGDescriptor']]], - ['derivated_20tools_256',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], - ['derivatives_257',['Sobel Derivatives',['https://docs.opencv.org/4.2.0/d2/d2c/tutorial_sobel_derivatives.html',1,'']]], - ['derived_258',['derived',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'Eigen::EigenBase::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'Eigen::EigenBase::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< FullPivLU< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< FullPivLU< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< HouseholderQR< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< HouseholderQR< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< Inverse< PermutationType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< Inverse< PermutationType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< LLT< _MatrixType, _UpLo > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< LLT< _MatrixType, _UpLo > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< PartialPivLU< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< PartialPivLU< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< PermutationWrapper< _IndicesType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< PermutationWrapper< _IndicesType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SVDBase< Derived > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SVDBase< Derived > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< Transpose< MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< Transpose< MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< TriangularView< MatrixType, Mode > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< TriangularView< MatrixType, Mode > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'Eigen::SolverBase::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'Eigen::SolverBase::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< FullPivLU< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< FullPivLU< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< HouseholderQR< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< HouseholderQR< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< LLT< _MatrixType, _UpLo > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< LLT< _MatrixType, _UpLo > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< PartialPivLU< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< PartialPivLU< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< SVDBase< Derived > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< SVDBase< Derived > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::derived() const']]], - ['derivx_5f_259',['derivX_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad015a0cf893db11d5e79a3fd60ae6d31',1,'cv::cudev::derivX_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad015a0cf893db11d5e79a3fd60ae6d31',1,'derivX_()(Global Namespace)']]], - ['derivxptr_260',['DerivXPtr',['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1cudev_1_1DerivXPtr.html',1,'cv::cudev']]], - ['derivxptr_261',['derivXPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7870c12342ebf45961b67757fdca23e',1,'cv::cudev::derivXPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7870c12342ebf45961b67757fdca23e',1,'derivXPtr()(Global Namespace)']]], - ['derivxptrsz_262',['DerivXPtrSz',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1cudev_1_1DerivXPtrSz.html',1,'cv::cudev']]], - ['derivy_5f_263',['derivY_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c290d1fa976dbd6901329f65a218766',1,'cv::cudev::derivY_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c290d1fa976dbd6901329f65a218766',1,'derivY_()(Global Namespace)']]], - ['derivyptr_264',['DerivYPtr',['https://docs.opencv.org/4.2.0/dc/d51/structcv_1_1cudev_1_1DerivYPtr.html',1,'cv::cudev']]], - ['derivyptr_265',['derivYPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga291c6ce7a6ec669ee01de73bd0db47b7',1,'cv::cudev::derivYPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga291c6ce7a6ec669ee01de73bd0db47b7',1,'derivYPtr()(Global Namespace)']]], - ['derivyptrsz_266',['DerivYPtrSz',['https://docs.opencv.org/4.2.0/d2/dfc/structcv_1_1cudev_1_1DerivYPtrSz.html',1,'cv::cudev']]], - ['desc_267',['desc',['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#a1136fc28a28da350d53f3332769c25a2',1,'cv::gapi::ie::Params']]], - ['desc_5fnpca_268',['desc_npca',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a92346cbad37a3b82924f422d70261a65',1,'cv::TrackerKCF::Params']]], - ['desc_5fpca_269',['desc_pca',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a478cf7e3a32518b4003f26624bd02680',1,'cv::TrackerKCF::Params']]], - ['descr_5fformat_5fcol_5fby_5fcol_270',['DESCR_FORMAT_COL_BY_COL',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a0931e149238b27ba63357cbde12dcf1aae896332fd7b76bda217f50049f74d4db',1,'cv::HOGDescriptor']]], - ['descr_5fformat_5frow_5fby_5frow_271',['DESCR_FORMAT_ROW_BY_ROW',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a0931e149238b27ba63357cbde12dcf1aa1a8f620a538dee55bf8c8d0c06fb62aa',1,'cv::HOGDescriptor']]], - ['descr_5fof_272',['descr_of',['https://docs.opencv.org/4.2.0/dd/d1c/classcv_1_1gapi_1_1wip_1_1GCaptureSource.html#ad92fceb8177f0fb129137f35d50dce93',1,'cv::gapi::wip::GCaptureSource::descr_of()'],['https://docs.opencv.org/4.2.0/da/d03/classcv_1_1gapi_1_1wip_1_1IStreamSource.html#a183343b6247b7a4ec24e8ec795795611',1,'cv::gapi::wip::IStreamSource::descr_of()'],['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html#a73c4a2badc87649fe4e86f29276258ec',1,'cv::detail::VectorRef::descr_of()'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga0d1b4f7d1dbc43b5ac9ddd6454348f0c',1,'cv::descr_of(const std::vector< U > &)'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#gabbf80cc9bfd0c3d488e387be16640851',1,'cv::descr_of(const cv::Scalar &scalar)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a4ca22b87ab820eabc7131c3aee9772b1',1,'cv::descr_of(const cv::gapi::own::Scalar &scalar)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a20929f881a7bc75ea132fe75b364cb86',1,'cv::descr_of(const GRunArg &arg)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a4b8e663ec9d66a2e5f35fec1d77b4b63',1,'cv::descr_of(const GRunArgs &args)'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga9f0311186061ecb4250c25ec388fbecc',1,'cv::descr_of(const cv::Mat &mat)'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#gaab82cc8af201a0634401cfff3e5f6ed8',1,'cv::descr_of(const cv::UMat &mat)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a6addd09dba37c9c7fb2cbd58beb6d5cc',1,'cv::gapi::own::descr_of()'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga0d1b4f7d1dbc43b5ac9ddd6454348f0c',1,'descr_of(const std::vector< U > &)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#gabbf80cc9bfd0c3d488e387be16640851',1,'descr_of(const cv::Scalar &scalar)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga9f0311186061ecb4250c25ec388fbecc',1,'descr_of(const cv::Mat &mat)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#gaab82cc8af201a0634401cfff3e5f6ed8',1,'descr_of(const cv::UMat &mat)(Global Namespace)']]], + ['data_20format_20hdf_20i_20o_5',['The Hierarchical Data Format (hdf) I/O',['https://docs.opencv.org/4.2.0/d3/d00/tutorial_table_of_content_hdf.html',1,'']]], + ['data_20format_20i_20o_20routines_6',['Hierarchical Data Format I/O routines',['https://docs.opencv.org/4.2.0/db/d77/group__hdf.html',1,'']]], + ['data_20format_20version_205_7',['Hierarchical Data Format version 5',['https://docs.opencv.org/4.2.0/d6/dee/group__hdf5.html',1,'']]], + ['data_20generation_20using_20icosphere_8',['Training data generation using Icosphere',['https://docs.opencv.org/4.2.0/d6/df4/tutorial_data_generation.html',1,'']]], + ['data_20structure_20type_9',['Data Structure Type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01539.html',1,'']]], + ['data_20structures_10',['Data Structures',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html',1,'Data Structures'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01536.html',1,'Policy-Based Data Structures'],['https://docs.opencv.org/4.2.0/d5/df1/tutorial_js_some_data_structures.html',1,'Some Data Structures']]], + ['data_20types_11',['G-API Data Types',['https://docs.opencv.org/4.2.0/db/df1/group__gapi__data__objects.html',1,'']]], + ['data_20using_20knn_12',['OCR of Hand-written Data using kNN',['https://docs.opencv.org/4.2.0/d8/d4b/tutorial_py_knn_opencv.html',1,'']]], + ['data_20using_20svm_13',['OCR of Hand-written Data using SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'']]], + ['data_5fas_5fcol_14',['DATA_AS_COL',['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#ae8a94a2add0555b0414e85c08ff67f50a2c52b7c4c9721a3e04a1d6699e738093',1,'cv::PCA']]], + ['data_5fas_5frow_15',['DATA_AS_ROW',['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#ae8a94a2add0555b0414e85c08ff67f50a159399e962048f705645483ca16e9fd6',1,'cv::PCA']]], + ['data_5fgeneration_2emarkdown_16',['data_generation.markdown',['https://docs.opencv.org/4.2.0/d5/d8e/data__generation_8markdown.html',1,'']]], + ['dataclock_17',['dataclock',['../namespacerobot_1_1types.html#ae853854e1c1dbbb2dc44e06838c4cf54',1,'robot::types']]], + ['datadepth_18',['DataDepth',['https://docs.opencv.org/4.2.0/d7/d0e/classcv_1_1DataDepth.html',1,'cv']]], + ['dataend_19',['dataend',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ad76c4f58490134f1acf3e580e669c58b',1,'cv::cuda::GpuMat::dataend'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a895b08a1958e4d6a73bd5410a7b86c3b',1,'cv::cuda::HostMem::dataend'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ae756e84c94cbcf4c152ed0e67edb71ca',1,'cv::Mat::dataend']]], + ['datalimit_20',['datalimit',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a21a0a0eb9814f0093452601fcbdc8a46',1,'cv::Mat']]], + ['datamov_5futils_2ehpp_21',['datamov_utils.hpp',['https://docs.opencv.org/4.2.0/df/dcf/datamov__utils_8hpp.html',1,'']]], + ['datapoint_22',['DataPoint',['../classrobot_1_1types_1_1DataPoint.html',1,'robot::types::DataPoint< T >'],['../classrobot_1_1types_1_1DataPoint.html#a81904e68e4e9e64bb541bcb2f3f8247c',1,'robot::types::DataPoint::DataPoint()'],['../classrobot_1_1types_1_1DataPoint.html#a2ad044a12fa674b131ab0a9ba0528481',1,'robot::types::DataPoint::DataPoint(T data)'],['../classrobot_1_1types_1_1DataPoint.html#a5e1f88b845b3194f26540bf6acc351b8',1,'robot::types::DataPoint::DataPoint(datatime_t time, T data)']]], + ['datapoint_3c_20eigen_3a_3aquaternion_20_3e_23',['DataPoint< Eigen::Quaternion >',['../classrobot_1_1types_1_1DataPoint.html',1,'robot::types']]], + ['datapoint_3c_20navtypes_3a_3agpscoords_5ft_20_3e_24',['DataPoint< navtypes::gpscoords_t >',['../classrobot_1_1types_1_1DataPoint.html',1,'robot::types']]], + ['dataset_25',['Dataset',['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html',1,'cv::datasets::Dataset'],['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html#a1ee05dbac222fa10c0fe6dd6b8713b48',1,'cv::datasets::Dataset::Dataset()']]], + ['dataset_2ehpp_26',['dataset.hpp',['https://docs.opencv.org/4.2.0/dc/d6a/dataset_8hpp.html',1,'']]], + ['datasets_27',['Creating, Writing and Reading Datasets',['https://docs.opencv.org/4.2.0/d4/d93/tutorial_hdf_create_read_write_datasets.html',1,'']]], + ['datasets_28',['Framework for working with different datasets',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html',1,'']]], + ['datasettype_29',['datasetType',['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html#ga570cd866657e421a9d34fd891214cdac',1,'cv::datasets::datasetType'],['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html#ga570cd866657e421a9d34fd891214cdac',1,'datasetType(Global Namespace)']]], + ['datastart_30',['datastart',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ade4a4dfc61facd5f18143b4c9d56dbae',1,'cv::cuda::GpuMat::datastart'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a5e62aeda0a11c82ed104ad2c0475e1fb',1,'cv::cuda::HostMem::datastart'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aeda6d607bfc629a95f59e7b538832172',1,'cv::Mat::datastart']]], + ['datatime_5ft_31',['datatime_t',['../namespacerobot_1_1types.html#a35269b68b316ac7d17d073a5d1a419b7',1,'robot::types']]], + ['datatype_32',['DataType',['https://docs.opencv.org/4.2.0/d0/d3a/classcv_1_1DataType.html',1,'cv']]], + ['datatype_33',['dataType',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#af8db03a57fe9b8ddcbc09f2ff90e3797',1,'cv::tracking::UnscentedKalmanFilterParams']]], + ['date_5forder_34',['date_order',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a876bb3dcd1727291a72dbb4dd890e229',1,'std::time_get::date_order()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a876bb3dcd1727291a72dbb4dd890e229',1,'std::time_get_byname::date_order()']]], + ['db_35',['db',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a172ccaaba996db5201af1c17c04a5fe8ae6f9dbf9718c71c2bc102b015f57b508',1,'cv']]], + ['dc_36',['dc',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a172ccaaba996db5201af1c17c04a5fe8abadade4f1a640599f9a68ab13df7a8b8',1,'cv']]], + ['dct_37',['dct',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga85aad4d668c01fbd64825f589e3696d4',1,'cv::dct()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga85aad4d668c01fbd64825f589e3696d4',1,'dct()(Global Namespace)']]], + ['dct2d_38',['DCT2D',['https://docs.opencv.org/4.2.0/d5/d57/structcv_1_1hal_1_1DCT2D.html',1,'cv::hal']]], + ['dct_5fimage_5fdenoising_2ehpp_39',['dct_image_denoising.hpp',['https://docs.opencv.org/4.2.0/da/dd8/dct__image__denoising_8hpp.html',1,'']]], + ['dct_5finverse_40',['DCT_INVERSE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca7d18108cbce9d52e6496633c713587da',1,'cv::DCT_INVERSE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca7d18108cbce9d52e6496633c713587da',1,'DCT_INVERSE(Global Namespace)']]], + ['dct_5frows_41',['DCT_ROWS',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca49bc8de8aedbe7fabb8960445133e494',1,'cv::DCT_ROWS'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca49bc8de8aedbe7fabb8960445133e494',1,'DCT_ROWS(Global Namespace)']]], + ['dctdenoising_42',['dctDenoising',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga14261b2fd705095a0c405da342fdff55',1,'cv::xphoto::dctDenoising()'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#ga14261b2fd705095a0c405da342fdff55',1,'dctDenoising()(Global Namespace)']]], + ['ddot_43',['ddot',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'cv::Matx::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< _Tp, cn, 1 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, 1, 3 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, 2, 2 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, 2, 3 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, 3, 3 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, 3, 4 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, 4, 4 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< double, cn, 1 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< float, 2, 3 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< float, 3, 3 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< float, cn, 1 >::ddot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad36bff6ac4f8daa72099d7e1578b2370',1,'Matx< float_type, 4, 4 >::ddot()'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a7d7124092dacacf1fdbb473b308d87d1',1,'cv::Point3_::ddot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a7df967231a76a7c6c941ba170954ee8a',1,'cv::Point_::ddot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a7df967231a76a7c6c941ba170954ee8a',1,'Point_< double >::ddot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a7df967231a76a7c6c941ba170954ee8a',1,'Point_< float >::ddot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a7df967231a76a7c6c941ba170954ee8a',1,'Point_< int >::ddot()']]], + ['dealloc_44',['dealloc',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#a2ed9d487ec85b2b1fdab8f1d771b9573',1,'INCVMemAllocator::dealloc()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#aa525d97b8fd62d312a0a9c3773850691',1,'NCVMemNativeAllocator::dealloc()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#acfa65d226c7899813143e9a51ad6d9b2',1,'NCVMemStackAllocator::dealloc()']]], + ['deallocate_45',['deallocate',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#ae5535db0a39ba335418da7a7173f333d',1,'cv::Allocator::deallocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#aab78aeff0108ad5ba8c96baafd58702b',1,'cv::AutoBuffer::deallocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#aab78aeff0108ad5ba8c96baafd58702b',1,'AutoBuffer< double, 1 >::deallocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#aab78aeff0108ad5ba8c96baafd58702b',1,'AutoBuffer< int64, 1 >::deallocate()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#aab78aeff0108ad5ba8c96baafd58702b',1,'AutoBuffer< String, 1 >::deallocate()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ac6e9cdf9b450e360f005978b4e981b1a',1,'cv::Mat::deallocate()'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#ae1fc4401763093dbd126570562a3e0f1',1,'cv::MatAllocator::deallocate()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a8c3716c2b363388bb8e59212a50e6ba5',1,'cv::UMat::deallocate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#ae5f6b86b98b17e2ba39243ca8eaf4ee1',1,'__alloc_traits< _Tp_alloc_type >::deallocate(_Tp_alloc_type &__a, pointer __p, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ae5f6b86b98b17e2ba39243ca8eaf4ee1',1,'__alloc_traits< _Tp_alloc_type >::deallocate(_Tp_alloc_type &__a, pointer __p, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#ae5f6b86b98b17e2ba39243ca8eaf4ee1',1,'__gnu_cxx::__alloc_traits::deallocate(_Alloc &__a, pointer __p, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ae5f6b86b98b17e2ba39243ca8eaf4ee1',1,'__gnu_cxx::__alloc_traits::deallocate(_Alloc &__a, pointer __p, size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ae5f6b86b98b17e2ba39243ca8eaf4ee1',1,'allocator_traits< _Tp_alloc_type >::deallocate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#ae5f6b86b98b17e2ba39243ca8eaf4ee1',1,'std::allocator_traits::deallocate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a221deccca32f2195cfe2d521e14c736c',1,'std::allocator_traits< allocator< _Tp > >::deallocate()']]], + ['deblockmode_46',['DeblockMode',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a7c5853999aa0b35008758f560df63a82',1,'cv::cudacodec::EncoderParams']]], + ['deblur_47',['deblur',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a5892088e5543163d6d6f18467d200f32',1,'cv::videostab::DeblurerBase::deblur()'],['https://docs.opencv.org/4.2.0/dc/d86/classcv_1_1videostab_1_1NullDeblurer.html#a0c1480a2ab0491bbf34a872c06fb625b',1,'cv::videostab::NullDeblurer::deblur()'],['https://docs.opencv.org/4.2.0/df/d5b/classcv_1_1videostab_1_1WeightingDeblurer.html#a09f6d7f55c474165423c72db7afe3d60',1,'cv::videostab::WeightingDeblurer::deblur()']]], + ['deblur_20filter_48',['Deblur Filter',['https://docs.opencv.org/4.2.0/d1/dfd/tutorial_motion_deblur_filter.html',1,'Motion Deblur Filter'],['https://docs.opencv.org/4.2.0/de/d3c/tutorial_out_of_focus_deblur_filter.html',1,'Out-of-focus Deblur Filter']]], + ['deblurer_5f_49',['deblurer_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#adae3e5a562d4491fc2cbc1bb1b2a6132',1,'cv::videostab::StabilizerBase']]], + ['deblurerbase_50',['DeblurerBase',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html',1,'cv::videostab::DeblurerBase'],['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#ae02367fc462a4caabcb56bafbd5bcc11',1,'cv::videostab::DeblurerBase::DeblurerBase()']]], + ['deblurrer_51',['deblurrer',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a1ce9686e0c40d131f606cfa1feb73181',1,'cv::videostab::StabilizerBase']]], + ['deblurring_2ehpp_52',['deblurring.hpp',['https://docs.opencv.org/4.2.0/d4/db5/deblurring_8hpp.html',1,'']]], + ['debug_53',['debug',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#ac0520f0ff5216059099da94fd502683c',1,'cv::gapi::fluid::Buffer']]], + ['debug_2eh_54',['debug.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00752.html',1,'']]], + ['debug_2farray_55',['debug/array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16598.html',1,'']]], + ['debug_2fbitset_56',['debug/bitset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16610.html',1,'']]], + ['debug_2fdeque_57',['debug/deque',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16802.html',1,'']]], + ['debug_2fforward_5flist_58',['debug/forward_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16904.html',1,'']]], + ['debug_2flist_59',['debug/list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17057.html',1,'']]], + ['debug_2fmap_60',['debug/map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17066.html',1,'']]], + ['debug_2fmap_2eh_61',['debug/map.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17075.html',1,'']]], + ['debug_2fmultimap_2eh_62',['debug/multimap.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17087.html',1,'']]], + ['debug_2fmultiset_2eh_63',['debug/multiset.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17093.html',1,'']]], + ['debug_2fset_64',['debug/set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17213.html',1,'']]], + ['debug_2fset_2eh_65',['debug/set.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17222.html',1,'']]], + ['debug_2fstl_5fiterator_2eh_66',['debug/stl_iterator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17264.html',1,'']]], + ['debug_2fstring_67',['debug/string',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17267.html',1,'']]], + ['debug_2funordered_5fmap_68',['debug/unordered_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17333.html',1,'']]], + ['debug_2funordered_5fset_69',['debug/unordered_set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17342.html',1,'']]], + ['debug_2fvector_70',['debug/vector',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17354.html',1,'']]], + ['debug_5fallocator_71',['debug_allocator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10367.html',1,'__gnu_cxx']]], + ['debug_5fallocator_2eh_72',['debug_allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01046.html',1,'']]], + ['debug_5fmap_5fbase_2ehpp_73',['debug_map_base.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01145.html',1,'']]], + ['debug_5fmode_2ehpp_74',['debug_mode.hpp',['https://docs.opencv.org/4.2.0/d1/d9f/debug__mode_8hpp.html',1,'']]], + ['debugdmatch_75',['debugDMatch',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga68668c8dddd147c90070efa600c6d0ac',1,'cvv::debugDMatch(cv::InputArray img1, std::vector< cv::KeyPoint > keypoints1, cv::InputArray img2, std::vector< cv::KeyPoint > keypoints2, std::vector< cv::DMatch > matches, const impl::CallMetaData &data, const char *description=nullptr, const char *view=nullptr, bool useTrainDescriptor=true)'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga1a4749f275c79094d8db4825abe2cff7',1,'cvv::debugDMatch(cv::InputArray img1, std::vector< cv::KeyPoint > keypoints1, cv::InputArray img2, std::vector< cv::KeyPoint > keypoints2, std::vector< cv::DMatch > matches, const impl::CallMetaData &data, const std::string &description, const std::string &view, bool useTrainDescriptor=true)'],['https://docs.opencv.org/4.2.0/d7/d84/namespacecvv_1_1impl.html#a6dfa7a2f61782d810340ba5afe3205c9',1,'cvv::impl::debugDMatch()']]], + ['debugfilter_76',['debugFilter',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga7fcba850f6ecb852203e5622a37c3bc6',1,'cvv::debugFilter(cv::InputArray original, cv::InputArray result, impl::CallMetaData metaData=impl::CallMetaData(), const char *description=nullptr, const char *view=nullptr)'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga9ddffb4d96ca0b4dd47ae94bedc6def7',1,'cvv::debugFilter(cv::InputArray original, cv::InputArray result, impl::CallMetaData metaData, const ::std::string &description, const ::std::string &view="")'],['https://docs.opencv.org/4.2.0/d7/d84/namespacecvv_1_1impl.html#a81d0d251c62351b2f9372074d1303f8a',1,'cvv::impl::debugFilter()']]], + ['debugger_77',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['debugging_20of_20computer_20vision_20applications_78',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], + ['debugging_20of_20computer_20vision_20programs_79',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], + ['debugmode_80',['debugMode',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga1669e90a1a521eebc7c61a694bba2927',1,'cvv']]], + ['dec_81',['dec',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'basic_ios< char, _Traits >::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'basic_iostream< char >::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'basic_istream< char >::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'basic_istream< char, _Traits >::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'basic_ostream< char >::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'basic_ostream< char, _Traits >::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_fstream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_ifstream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_ios::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_iostream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_istream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_istringstream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_ofstream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_ostream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_ostringstream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::basic_stringstream::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a3b38d2c92a8191a8f6d4994c663d408e',1,'std::ios_base::dec'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a41ca573b6c90740c9355d373118d87f5',1,'std::dec(ios_base &__base)']]], + ['decay_82',['decay',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04231.html',1,'std']]], + ['decay_5ft_83',['decay_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#gabe26c12710bb4c683badfaf0a586c5be',1,'std::decay_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#gabe26c12710bb4c683badfaf0a586c5be',1,'decay_t(Global Namespace)']]], + ['decim_84',['decim',['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html#ad9b2878242df9ef65d1c4243e5c25f10',1,'cv::gapi::wip::draw::Mosaic']]], + ['decimal_85',['decimal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00998.html',1,'']]], + ['decimal_20floating_20point_20arithmetic_86',['Decimal Floating-Point Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01520.html',1,'']]], + ['decimal128_87',['decimal128',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09831.html',1,'std::decimal::decimal128'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09831.html#a0109f8036769986ae2b5cbb5b369b1fc',1,'std::decimal::decimal128::decimal128()']]], + ['decimal32_88',['decimal32',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09823.html',1,'std::decimal::decimal32'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09823.html#a0a56ec8df48bee17d6c22c53c0f160f8',1,'std::decimal::decimal32::decimal32()']]], + ['decimal32_5fto_5flong_5flong_89',['decimal32_to_long_long',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01584.html#a382d300aa924d2e205ddca22d677dcec',1,'std::decimal']]], + ['decimal64_90',['decimal64',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09827.html',1,'std::decimal::decimal64'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09827.html#afc30d8fb426619b5f29cf8b590c6b331',1,'std::decimal::decimal64::decimal64()']]], + ['decimal_5fpoint_91',['decimal_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a65fe46d62bb27b85e80b291d164193e1',1,'std::moneypunct::decimal_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a65fe46d62bb27b85e80b291d164193e1',1,'std::moneypunct_byname::decimal_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a77a3bcc91f7435d9a38705d681fc9189',1,'std::numpunct::decimal_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a77a3bcc91f7435d9a38705d681fc9189',1,'std::numpunct_byname::decimal_point()']]], + ['decode_92',['decode',['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a4172c2eb4825c844fb1b0ae67202d329',1,'cv::QRCodeDetector::decode()'],['https://docs.opencv.org/4.2.0/d9/dbb/classcv_1_1structured__light_1_1StructuredLightPattern.html#a4cc409edf8a330eeccba6737d391da34',1,'cv::structured_light::StructuredLightPattern::decode()']]], + ['decode_20gray_20code_20pattern_20tutorial_93',['Decode Gray code pattern tutorial',['https://docs.opencv.org/4.2.0/dc/da9/tutorial_decode_graycode_pattern.html',1,'']]], + ['decode_5f3d_5funderworld_94',['DECODE_3D_UNDERWORLD',['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html#gga8c656fa76189bd6dc1b2a444f680b60aa98f0a8c890dded38d226722bcdd5795c',1,'cv::structured_light::DECODE_3D_UNDERWORLD'],['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html#gga8c656fa76189bd6dc1b2a444f680b60aa98f0a8c890dded38d226722bcdd5795c',1,'DECODE_3D_UNDERWORLD(Global Namespace)']]], + ['decodeparameters_95',['decodeParameters',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a1ce3447b0344cfade75947e2fe0e6914',1,'cv::omnidir::internal']]], + ['decodeparametersstereo_96',['decodeParametersStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#abd67a34e9f9f1e1fb27afa5b7762b333',1,'cv::omnidir::internal']]], + ['decoder_5fmode_97',['decoder_mode',['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gac013d7b1a6a1b7d739b89474c20ec086',1,'cv::text::decoder_mode'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html#gac013d7b1a6a1b7d739b89474c20ec086',1,'decoder_mode(Global Namespace)']]], + ['decoding_98',['Video Encoding/Decoding',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html',1,'']]], + ['decolor_99',['decolor',['https://docs.opencv.org/4.2.0/d4/d32/group__photo__decolor.html#ga4864d4c007bda5dacdc5e9d4ed7e222c',1,'cv::decolor()'],['https://docs.opencv.org/4.2.0/d4/d32/group__photo__decolor.html#ga4864d4c007bda5dacdc5e9d4ed7e222c',1,'decolor(InputArray src, OutputArray grayscale, OutputArray color_boost)(Global Namespace)']]], + ['decolorization_100',['Contrast Preserving Decolorization',['https://docs.opencv.org/4.2.0/d4/d32/group__photo__decolor.html',1,'']]], + ['decomp_5fcholesky_101',['DECOMP_CHOLESKY',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca33cf860f98004310374a81d2c01715da',1,'cv::DECOMP_CHOLESKY'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca33cf860f98004310374a81d2c01715da',1,'DECOMP_CHOLESKY(Global Namespace)']]], + ['decomp_5feig_102',['DECOMP_EIG',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca3fc1b148b39f0ca4ac5fc6e0f1b7198b',1,'cv::DECOMP_EIG'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca3fc1b148b39f0ca4ac5fc6e0f1b7198b',1,'DECOMP_EIG(Global Namespace)']]], + ['decomp_5flu_103',['DECOMP_LU',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca247a3455cd64973152e17e26999dc024',1,'cv::DECOMP_LU'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca247a3455cd64973152e17e26999dc024',1,'DECOMP_LU(Global Namespace)']]], + ['decomp_5fnormal_104',['DECOMP_NORMAL',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca13eaae0241295166140291223db12166',1,'cv::DECOMP_NORMAL'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca13eaae0241295166140291223db12166',1,'DECOMP_NORMAL(Global Namespace)']]], + ['decomp_5fqr_105',['DECOMP_QR',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674cab086be5a080138d7db9b11dab378d845',1,'cv::DECOMP_QR'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674cab086be5a080138d7db9b11dab378d845',1,'DECOMP_QR(Global Namespace)']]], + ['decomp_5fsvd_106',['DECOMP_SVD',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca523b676c90c7a1d2841b1267ba9ba614',1,'cv::DECOMP_SVD'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaaf9ea5dcc392d5ae04eacb9920b9674ca523b676c90c7a1d2841b1267ba9ba614',1,'DECOMP_SVD(Global Namespace)']]], + ['decomposeessentialmat_107',['decomposeEssentialMat',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga54a2f5b3f8aeaf6c76d4a31dece85d5d',1,'cv::decomposeEssentialMat()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga54a2f5b3f8aeaf6c76d4a31dece85d5d',1,'decomposeEssentialMat()(Global Namespace)']]], + ['decomposehomographymat_108',['decomposeHomographyMat',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga7f60bdff78833d1e3fd6d9d0fd538d92',1,'cv::decomposeHomographyMat()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga7f60bdff78833d1e3fd6d9d0fd538d92',1,'decomposeHomographyMat()(Global Namespace)']]], + ['decomposeprojectionmatrix_109',['decomposeProjectionMatrix',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaaae5a7899faa1ffdf268cd9088940248',1,'cv::decomposeProjectionMatrix()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaaae5a7899faa1ffdf268cd9088940248',1,'decomposeProjectionMatrix(InputArray projMatrix, OutputArray cameraMatrix, OutputArray rotMatrix, OutputArray transVect, OutputArray rotMatrixX=noArray(), OutputArray rotMatrixY=noArray(), OutputArray rotMatrixZ=noArray(), OutputArray eulerAngles=noArray())(Global Namespace)']]], + ['decomposition_110',['decomposition',['https://docs.opencv.org/4.2.0/d8/d0e/group__core__hal__interface__decomp__cholesky.html',1,'Cholesky matrix decomposition'],['https://docs.opencv.org/4.2.0/d5/d42/group__core__hal__interface__decomp__lu.html',1,'LU matrix decomposition'],['https://docs.opencv.org/4.2.0/db/d36/group__core__hal__interface__decomp__qr.html',1,'QR matrix decomposition'],['https://docs.opencv.org/4.2.0/dd/d2a/group__core__hal__interface__decomp__svd.html',1,'Singular value matrix decomposition']]], + ['decompositionoptions_111',['DecompositionOptions',['https://eigen.tuxfamily.org/dox/group__enums.html#gae3e239fb70022eb8747994cf5d68b4a9',1,'Eigen::DecompositionOptions'],['https://eigen.tuxfamily.org/dox/group__enums.html#gae3e239fb70022eb8747994cf5d68b4a9',1,'DecompositionOptions(Global Namespace)']]], + ['decompositions_112',['decompositions',['https://eigen.tuxfamily.org/dox/group__DenseDecompositionBenchmark.html',1,'Benchmark of dense decompositions'],['https://eigen.tuxfamily.org/dox/group__TopicLinearAlgebraDecompositions.html',1,'Catalogue of dense decompositions'],['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'Dense linear problems and decompositions'],['https://eigen.tuxfamily.org/dox/group__InplaceDecomposition.html',1,'Inplace matrix decompositions'],['https://eigen.tuxfamily.org/dox/group__TutorialLinearAlgebra.html',1,'Linear algebra and decompositions']]], + ['decomptypes_113',['DecompTypes',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaaf9ea5dcc392d5ae04eacb9920b9674c',1,'cv::DecompTypes'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaaf9ea5dcc392d5ae04eacb9920b9674c',1,'DecompTypes(Global Namespace)']]], + ['deconvolutionlayer_114',['DeconvolutionLayer',['https://docs.opencv.org/4.2.0/dd/d77/classcv_1_1dnn_1_1DeconvolutionLayer.html',1,'cv::dnn']]], + ['deep_20learning_20layers_20support_115',['Custom deep learning layers support',['https://docs.opencv.org/4.2.0/dc/db1/tutorial_dnn_custom_layers.html',1,'']]], + ['deep_20networks_20in_20browser_116',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], + ['deep_20networks_20on_20android_20device_117',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], + ['deep_20neural_20network_20module_118',['Deep Neural Network module',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html',1,'']]], + ['deep_20neural_20networks_20dnn_20module_119',['Deep Neural Networks (dnn module)',['https://docs.opencv.org/4.2.0/d2/d58/tutorial_table_of_content_dnn.html',1,'']]], + ['default_120',['DEFAULT',['https://docs.opencv.org/4.2.0/d8/d6f/structcv_1_1line__descriptor_1_1DrawLinesMatchesFlags.html#af77f9b45585f16821d7a06ea38909e68a2e8e234416ae60a082f9078f3b4ff083',1,'cv::line_descriptor::DrawLinesMatchesFlags::DEFAULT'],['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa912544338415c5f8c8e55e85a139bfbadc617558c0a38a21d08622aba3ea6ab3',1,'cv::cuda::Event::DEFAULT'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a5b39c8b553c821e7cddc6da64b5bd2ee',1,'DEFAULT(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a5b39c8b553c821e7cddc6da64b5bd2ee',1,'DEFAULT(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a5b39c8b553c821e7cddc6da64b5bd2ee',1,'DEFAULT(Global Namespace)']]], + ['default2dmotion_121',['default2dMotion',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#a30dc41affb537f4c8af23bebc18defa1',1,'cv::videostab::RansacParams']]], + ['default_5fcomb_5fhash_5ffn_122',['default_comb_hash_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11463.html',1,'__gnu_pbds::detail']]], + ['default_5fdelete_123',['default_delete',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07995.html',1,'std::default_delete< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07995.html#a304c2d88d632c1023b5cf06066d18440',1,'std::default_delete::default_delete() noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07995.html#a91c7d2434b31fc4d62155d108d1bfd99',1,'std::default_delete::default_delete(const default_delete< _Up > &) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07999.html#a8add7bace07168095265e2cbe19cd3fe',1,'std::default_delete< _Tp[]>::default_delete() noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07999.html#aec0bac655768abe7060853f80292614f',1,'std::default_delete< _Tp[]>::default_delete(const default_delete< _Up[]> &) noexcept']]], + ['default_5fdelete_3c_20_5ftp_5b_5d_3e_124',['default_delete< _Tp[]>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07999.html',1,'std']]], + ['default_5feq_5ffn_125',['default_eq_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11459.html',1,'__gnu_pbds::detail']]], + ['default_5fhash_5ffn_126',['default_hash_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11455.html',1,'__gnu_pbds::detail']]], + ['default_5fmax_5fdepth_127',['DEFAULT_MAX_DEPTH',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#ab9b0710c56e1ba0d861a16cae2000c78',1,'cv::rgbd::Odometry']]], + ['default_5fmax_5fdepth_5fdiff_128',['DEFAULT_MAX_DEPTH_DIFF',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#ace1301318716355d12586c3028e84e1e',1,'cv::rgbd::Odometry']]], + ['default_5fmax_5fiters_129',['DEFAULT_MAX_ITERS',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a4af5b1a72ec68db46d5199d63a983d83a1e62e599654778422db115bccb56c40a',1,'cv::ml::EM']]], + ['default_5fmax_5fpoints_5fpart_130',['DEFAULT_MAX_POINTS_PART',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a9a301d39d2dd32519ac1b6f8cfefc358',1,'cv::rgbd::Odometry']]], + ['default_5fmax_5frotation_131',['DEFAULT_MAX_ROTATION',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a47b0d3af975ec11c285bb544d54b3720',1,'cv::rgbd::Odometry']]], + ['default_5fmax_5ftranslation_132',['DEFAULT_MAX_TRANSLATION',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a6a08d1b708ab5de096df80d90f9029b6',1,'cv::rgbd::Odometry']]], + ['default_5fmin_5fdepth_133',['DEFAULT_MIN_DEPTH',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a4f7854bd4c50808fbb1328c8faba4023',1,'cv::rgbd::Odometry']]], + ['default_5fnclusters_134',['DEFAULT_NCLUSTERS',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a4af5b1a72ec68db46d5199d63a983d83a19593ad7143e258ab5f7cb0174f3403a',1,'cv::ml::EM']]], + ['default_5fnlevels_135',['DEFAULT_NLEVELS',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a1e9057ce853bfbdf4e43cea380396d37a00a697fa3ad742792128a39785a60ed2',1,'cv::HOGDescriptor']]], + ['default_5fparallel_5ftag_136',['default_parallel_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09711.html',1,'__gnu_parallel']]], + ['default_5fprobe_5ffn_137',['default_probe_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11475.html',1,'__gnu_pbds::detail']]], + ['default_5fresize_5fpolicy_138',['default_resize_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11467.html',1,'__gnu_pbds::detail']]], + ['default_5fstep_139',['default_step',['https://docs.opencv.org/4.2.0/d0/d06/namespacecv_1_1gapi_1_1own_1_1detail.html#aafeec5427533d638f2f8437397363899',1,'cv::gapi::own::detail']]], + ['default_5ftrie_5faccess_5ftraits_140',['default_trie_access_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11479.html',1,'__gnu_pbds::detail']]], + ['default_5ftrie_5faccess_5ftraits_3c_20std_3a_3abasic_5fstring_3c_20char_2c_20char_5ftraits_2c_20std_3a_3aallocator_3c_20char_20_3e_20_3e_20_3e_141',['default_trie_access_traits< std::basic_string< Char, Char_Traits, std::allocator< char > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11483.html',1,'__gnu_pbds::detail']]], + ['default_5fupdate_5fpolicy_142',['default_update_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11471.html',1,'__gnu_pbds::detail']]], + ['defaultallocator_143',['defaultAllocator',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ad3e0ed263377f0989c3490f3d496a201',1,'cv::cuda::GpuMat']]], + ['defaultavcapturedeviceposition_144',['defaultAVCaptureDevicePosition',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a038fae0411c8b8fe316c27287a00f745',1,'CvAbstractCamera']]], + ['defaultavcapturesessionpreset_145',['defaultAVCaptureSessionPreset',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a53a3585adb702512e86023aee31607e5',1,'CvAbstractCamera']]], + ['defaultavcapturevideoorientation_146',['defaultAVCaptureVideoOrientation',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a3190de91139b32e8bf15d47e8a75e97d',1,'CvAbstractCamera']]], + ['defaultcopypolicy_147',['DefaultCopyPolicy',['https://docs.opencv.org/4.2.0/d8/dc2/structcv_1_1cudev_1_1DefaultCopyPolicy.html',1,'cv::cudev']]], + ['defaultdeleter_3c_20cvcapture_20_3e_148',['DefaultDeleter< CvCapture >',['https://docs.opencv.org/4.2.0/d0/d90/structcv_1_1DefaultDeleter_3_01CvCapture_01_4.html',1,'cv']]], + ['defaultdeleter_3c_20cvhaarclassifiercascade_20_3e_149',['DefaultDeleter< CvHaarClassifierCascade >',['https://docs.opencv.org/4.2.0/d9/ddf/structcv_1_1DefaultDeleter_3_01CvHaarClassifierCascade_01_4.html',1,'cv']]], + ['defaultdeleter_3c_20cvvideowriter_20_3e_150',['DefaultDeleter< CvVideoWriter >',['https://docs.opencv.org/4.2.0/d2/d37/structcv_1_1DefaultDeleter_3_01CvVideoWriter_01_4.html',1,'cv']]], + ['defaultdeviceinitializer_151',['DefaultDeviceInitializer',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#ab98d52cf0377206238fa449eebe36ab9',1,'cv::cuda::Stream']]], + ['defaultdir_152',['defaultDir',['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#ab49b384f6be30177f811cb7ae0c81406',1,'cv::ml::DTrees::Node']]], + ['defaultfloat_153',['defaultfloat',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a74ba205196abe11761ff1c8016d6b5df',1,'std']]], + ['defaultfps_154',['defaultFPS',['https://docs.opencv.org/4.2.0/d0/de8/interfaceCvAbstractCamera.html#a4191912661631d746270dc24a0b9a902',1,'CvAbstractCamera']]], + ['defaultglobreducepolicy_155',['DefaultGlobReducePolicy',['https://docs.opencv.org/4.2.0/d2/d04/structcv_1_1cudev_1_1DefaultGlobReducePolicy.html',1,'cv::cudev']]], + ['defaulthistogrampolicy_156',['DefaultHistogramPolicy',['https://docs.opencv.org/4.2.0/d4/d2b/structcv_1_1cudev_1_1DefaultHistogramPolicy.html',1,'cv::cudev']]], + ['defaultnorm_157',['defaultNorm',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a934a22d5f2277347623e355d8a4b8d0e',1,'cv::line_descriptor::BinaryDescriptor::defaultNorm()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a90e93108d3d7ffdf21889a2f1aa1faa8',1,'cv::Feature2D::defaultNorm()'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a2309d119986eadf6ee099ad5bf78ed98',1,'cv::cuda::SURF_CUDA::defaultNorm()']]], + ['defaultparams_158',['defaultParams',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#ac3fdcd26d5141bbc2d6e0ded9faf5bc0',1,'cv::dynafu::Params::defaultParams()'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#aef7f84e8deb0ee8272ee861d084fcb11',1,'cv::kinfu::Params::defaultParams()']]], + ['defaultreducetovecpolicy_159',['DefaultReduceToVecPolicy',['https://docs.opencv.org/4.2.0/d3/dd7/structcv_1_1cudev_1_1DefaultReduceToVecPolicy.html',1,'cv::cudev']]], + ['defaultsplitmergepolicy_160',['DefaultSplitMergePolicy',['https://docs.opencv.org/4.2.0/d9/d3a/structcv_1_1cudev_1_1DefaultSplitMergePolicy.html',1,'cv::cudev']]], + ['defaulttransformpolicy_161',['DefaultTransformPolicy',['https://docs.opencv.org/4.2.0/db/db3/structcv_1_1cudev_1_1DefaultTransformPolicy.html',1,'cv::cudev']]], + ['defaulttransposepolicy_162',['DefaultTransposePolicy',['https://docs.opencv.org/4.2.0/dd/d44/structcv_1_1cudev_1_1DefaultTransposePolicy.html',1,'cv::cudev']]], + ['defer_5flock_163',['defer_lock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga70a73adf8c062ea682cd99580d0a39be',1,'std::defer_lock'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga70a73adf8c062ea682cd99580d0a39be',1,'defer_lock(Global Namespace)']]], + ['defer_5flock_5ft_164',['defer_lock_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07195.html',1,'std']]], + ['deferred_165',['deferred',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4a43fff3df3fc0b3417c86dc3040fb2d86',1,'deferred(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5ba43fff3df3fc0b3417c86dc3040fb2d86',1,'deferred(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4a43fff3df3fc0b3417c86dc3040fb2d86',1,'deferred(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5ba43fff3df3fc0b3417c86dc3040fb2d86',1,'deferred(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4a43fff3df3fc0b3417c86dc3040fb2d86',1,'deferred(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga6f4ad125d364f01560e2ed20a3c8bb5ba43fff3df3fc0b3417c86dc3040fb2d86',1,'deferred(Global Namespace)']]], + ['defines_2eh_166',['defines.h',['https://docs.opencv.org/4.2.0/d8/db0/defines_8h.html',1,'']]], + ['deformable_20part_20based_20models_167',['Deformable Part-based Models',['https://docs.opencv.org/4.2.0/d9/d12/group__dpm.html',1,'']]], + ['degree_168',['DEGREE',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3a61a897bf6519f4be834ce379a1543869',1,'cv::ml::SVM']]], + ['delegate_169',['delegate',['https://docs.opencv.org/4.2.0/d4/d1d/interfaceCvPhotoCamera.html#a7198da91a6278007ffa227ed1ae0bdc4',1,'CvPhotoCamera::delegate'],['https://docs.opencv.org/4.2.0/db/da9/interfaceCvVideoCamera.html#a34e036fdee24dcf4e0ca57e938b77cbd',1,'CvVideoCamera::delegate']]], + ['deletedatainstance_170',['deleteDataInstance',['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#a6a197810db6d03c4397ee203eb9a2fad',1,'cv::TLSData::deleteDataInstance()'],['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html#a6a197810db6d03c4397ee203eb9a2fad',1,'TLSData< cv::instr::NodeDataTls >::deleteDataInstance()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#accf3a284d5358bcd39aab9df897fa206',1,'cv::TLSDataAccumulator::deleteDataInstance()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#accf3a284d5358bcd39aab9df897fa206',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::deleteDataInstance()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#ab9969d79ef0b1acb9e26548a283e1059',1,'cv::TLSDataContainer::deleteDataInstance()']]], + ['deleteedge_171',['deleteEdge',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aab7fdb247262a8ffb638e745c9faed06',1,'cv::Subdiv2D']]], + ['deletepoint_172',['deletePoint',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a78dfd541b7d8eb856b360189ac1a3912',1,'cv::Subdiv2D']]], + ['delta_173',['delta',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#ab5e69103deaefe02cb3dbcee713b12b8',1,'cv::cuda::FGDParams']]], + ['demosaicing_174',['demosaicing',['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga57261f12fccf872a2b2d66daf29d5bd0',1,'cv::demosaicing()'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga7fb153572b573ebd2d7610fcbe64166e',1,'cv::cuda::demosaicing()'],['https://docs.opencv.org/4.2.0/d8/d01/group__imgproc__color__conversions.html#ga57261f12fccf872a2b2d66daf29d5bd0',1,'demosaicing(InputArray src, OutputArray dst, int code, int dstCn=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga7fb153572b573ebd2d7610fcbe64166e',1,'demosaicing(InputArray src, OutputArray dst, int code, int dcn=-1, Stream &stream=Stream::Null())(Global Namespace)']]], + ['demosaictypes_175',['DemosaicTypes',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gaa9e40b798350356f45667e609d5d82f9',1,'cv::cuda::DemosaicTypes'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#gaa9e40b798350356f45667e609d5d82f9',1,'DemosaicTypes(Global Namespace)']]], + ['denoise_5ftvl1_176',['denoise_TVL1',['https://docs.opencv.org/4.2.0/d1/d79/group__photo__denoise.html#ga7602ed5ae17b7de40152b922227c4e4f',1,'cv::denoise_TVL1()'],['https://docs.opencv.org/4.2.0/d1/d79/group__photo__denoise.html#ga7602ed5ae17b7de40152b922227c4e4f',1,'denoise_TVL1(const std::vector< Mat > &observations, Mat &result, double lambda=1.0, int niters=30)(Global Namespace)']]], + ['denoising_177',['Denoising',['https://docs.opencv.org/4.2.0/d1/d79/group__photo__denoise.html',1,'Denoising'],['https://docs.opencv.org/4.2.0/d5/d69/tutorial_py_non_local_means.html',1,'Image Denoising']]], + ['denorm_5fabsent_178',['denorm_absent',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d4e3dd02abab45dde95b5bb4ae7fdbfad91095a64f12657bc911d2cecd4fab0d',1,'std']]], + ['denorm_5findeterminate_179',['denorm_indeterminate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d4e3dd02abab45dde95b5bb4ae7fdbfa33fdcd73e760174c19ab87389eb104ae',1,'std']]], + ['denorm_5fmin_180',['denorm_min',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#ab1f0b8ed143b9669ed2552db8dc84948',1,'std::numeric_limits']]], + ['denorm_5fpresent_181',['denorm_present',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d4e3dd02abab45dde95b5bb4ae7fdbfa28c4fcc178853e4c66190bc2c5027de5',1,'std']]], + ['dense_182',['Dense',['https://eigen.tuxfamily.org/dox/structEigen_1_1Dense.html',1,'Eigen']]], + ['dense_20decompositions_183',['dense decompositions',['https://eigen.tuxfamily.org/dox/group__DenseDecompositionBenchmark.html',1,'Benchmark of dense decompositions'],['https://eigen.tuxfamily.org/dox/group__TopicLinearAlgebraDecompositions.html',1,'Catalogue of dense decompositions']]], + ['dense_20linear_20problems_20and_20decompositions_184',['Dense linear problems and decompositions',['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'']]], + ['dense_20matrix_20and_20array_20manipulation_185',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], + ['dense_20stereo_186',['Quasi dense Stereo',['https://docs.opencv.org/4.2.0/d7/d5a/tutorial_qds_quasi_dense_stereo.html',1,'']]], + ['dense_20stereo_20stereo_20module_187',['Quasi Dense Stereo (stereo module)',['https://docs.opencv.org/4.2.0/d9/d58/tutorial_table_of_content_quasi_dense_stereo.html',1,'']]], + ['dense_5fxpr_5fbase_5fdispatcher_188',['dense_xpr_base_dispatcher',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'Eigen::doxygen']]], + ['dense_5fxpr_5fbase_5fdispatcher_3c_20array_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_189',['dense_xpr_base_dispatcher< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher_3_01Array_3_01__Scalar_00_01__Rows_00_01_9f66d076f8f04907f9f0093247d3c377.html',1,'Eigen::doxygen']]], + ['dense_5fxpr_5fbase_5fdispatcher_3c_20array_3c_20double_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_190',['dense_xpr_base_dispatcher< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], + ['dense_5fxpr_5fbase_5fdispatcher_3c_20array_3c_20index_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_191',['dense_xpr_base_dispatcher< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], + ['dense_5fxpr_5fbase_5fdispatcher_3c_20array_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_192',['dense_xpr_base_dispatcher< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], + ['dense_5fxpr_5fbase_5fdispatcher_3c_20array_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_193',['dense_xpr_base_dispatcher< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], + ['dense_5fxpr_5fbase_5fdispatcher_3c_20array_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_194',['dense_xpr_base_dispatcher< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], + ['dense_5fxpr_5fbase_5fdispatcher_3c_20matrix_3c_20_5fscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_195',['dense_xpr_base_dispatcher< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher_3_01Matrix_3_01__Scalar_00_01__Rows_00_0116fa1ae814876cf66b62915b437740e6.html',1,'Eigen::doxygen']]], + ['dense_5fxpr_5fbase_5fdispatcher_3c_20matrix_3c_20complexscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_196',['dense_xpr_base_dispatcher< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], + ['dense_5fxpr_5fbase_5fdispatcher_3c_20matrix_3c_20int_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_197',['dense_xpr_base_dispatcher< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], + ['dense_5fxpr_5fbase_5fdispatcher_3c_20matrix_3c_20realscalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_198',['dense_xpr_base_dispatcher< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], + ['dense_5fxpr_5fbase_5fdispatcher_3c_20matrix_3c_20scalar_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_199',['dense_xpr_base_dispatcher< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], + ['dense_5fxpr_5fbase_5fdispatcher_3c_20matrix_3c_20storageindex_2c_20_5frows_2c_20_5fcols_2c_20_5foptions_2c_20_5fmaxrows_2c_20_5fmaxcols_20_3e_20_3e_200',['dense_xpr_base_dispatcher< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'']]], + ['densebase_201',['DenseBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html',1,'Eigen::DenseBase< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa284042d0e1b0ad9b6a00db7fd2d9f7f',1,'Eigen::DenseBase::DenseBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa284042d0e1b0ad9b6a00db7fd2d9f7f',1,'DenseBase< ArrayWrapper< ExpressionType > >::DenseBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa284042d0e1b0ad9b6a00db7fd2d9f7f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::DenseBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa284042d0e1b0ad9b6a00db7fd2d9f7f',1,'DenseBase< Solve< Decomposition, RhsType > >::DenseBase()']]], + ['densebase_3c_20arraywrapper_3c_20expressiontype_20_3e_20_3e_202',['DenseBase< ArrayWrapper< ExpressionType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html',1,'']]], + ['densebase_3c_20homogeneous_3c_20matrixtype_2c_20_5fdirection_20_3e_20_3e_203',['DenseBase< Homogeneous< MatrixType, _Direction > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html',1,'']]], + ['densebase_3c_20solve_3c_20decomposition_2c_20rhstype_20_3e_20_3e_204',['DenseBase< Solve< Decomposition, RhsType > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html',1,'']]], + ['densecoeffsbase_3c_20derived_2c_20directaccessors_20_3e_205',['DenseCoeffsBase< Derived, DirectAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html',1,'Eigen']]], + ['densecoeffsbase_3c_20derived_2c_20directwriteaccessors_20_3e_206',['DenseCoeffsBase< Derived, DirectWriteAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html',1,'Eigen']]], + ['densecoeffsbase_3c_20derived_2c_20readonlyaccessors_20_3e_207',['DenseCoeffsBase< Derived, ReadOnlyAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html',1,'Eigen']]], + ['densecoeffsbase_3c_20derived_2c_20writeaccessors_20_3e_208',['DenseCoeffsBase< Derived, WriteAccessors >',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html',1,'Eigen']]], + ['denseopticalflow_209',['DenseOpticalFlow',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1cuda_1_1DenseOpticalFlow.html',1,'cv::cuda::DenseOpticalFlow'],['https://docs.opencv.org/4.2.0/df/dde/classcv_1_1DenseOpticalFlow.html',1,'cv::DenseOpticalFlow']]], + ['denseopticalflowext_210',['DenseOpticalFlowExt',['https://docs.opencv.org/4.2.0/d1/d21/classcv_1_1superres_1_1DenseOpticalFlowExt.html',1,'cv::superres']]], + ['densepyrlkopticalflow_211',['DensePyrLKOpticalFlow',['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1cuda_1_1DensePyrLKOpticalFlow.html',1,'cv::cuda']]], + ['denserlofopticalflow_212',['DenseRLOFOpticalFlow',['https://docs.opencv.org/4.2.0/df/d59/classcv_1_1optflow_1_1DenseRLOFOpticalFlow.html',1,'cv::optflow']]], + ['densities_213',['densities',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a0269fcd857f0706a223f87155a3ff725',1,'std::piecewise_constant_distribution::densities()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#ae5a24184d9ada6b028d1bdc5555f5dbb',1,'std::piecewise_linear_distribution::densities()']]], + ['density_5fth_214',['density_th',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#a38490002643fee2bdf18c855e7ec02fa',1,'cv::line_descriptor::LSDParam']]], + ['densityneighborhoodsize_215',['densityNeighborhoodSize',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a9f79d2b1d49d869392f84d795d8137ba',1,'cv::CirclesGridFinderParameters']]], + ['dep_216',['dep',['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#aa20cc45779278c7f3c74b3c86f30c294',1,'cv::datasets::GR_skigObj']]], + ['depth_217',['depth',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a8ff44429b7c0b89c3f316fa76454da5a',1,'cv::GMatDesc::depth'],['https://docs.opencv.org/4.2.0/d3/dad/structcv_1_1datasets_1_1GR__chalearnObj.html#a7f4f6af840c97f7de852ec6bc9f5629c',1,'cv::datasets::GR_chalearnObj::depth'],['https://docs.opencv.org/4.2.0/d0/db6/structcv_1_1datasets_1_1OR__pascalObj.html#a74c850cbeccf31a5e85df42648637e75',1,'cv::datasets::OR_pascalObj::depth'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1datasets_1_1PD__inriaObj.html#a1e4a5a3b168e26e4c24bf6764f2490b1',1,'cv::datasets::PD_inriaObj::depth'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#acc9d7572731ae8bdbcbfd0423b5cb536',1,'cv::rgbd::RgbdFrame::depth'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a30d20f67815668353be5644725f78dfa',1,'cv::_InputArray::depth()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a4e9be9d9d7a99d1c12d1469ab7c35eee',1,'cv::ogl::Buffer::depth()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#aaa229d9b2b2f60ecae3b5fbf0603c1b9',1,'cv::cuda::GpuMat::depth()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#aec2636a0d4065f56f55373a7507c8b3c',1,'cv::cudev::GpuMat_::depth()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a1cb85c2b9f858bbc892b1dd282eba3c4',1,'cv::cuda::HostMem::depth()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a8da9f853b6f3a29d738572fd1ffc44c0',1,'cv::Mat::depth()'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#ac17970b7962e231610288a8b0f035161',1,'cv::gapi::own::Mat::depth()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ad1a85fe520ae0a75b8151a85cb1a616c',1,'cv::Mat_::depth()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ad1a85fe520ae0a75b8151a85cb1a616c',1,'Mat_< double >::depth()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ad1a85fe520ae0a75b8151a85cb1a616c',1,'Mat_< float >::depth()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ad1a85fe520ae0a75b8151a85cb1a616c',1,'Mat_< uchar >::depth()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ad1a85fe520ae0a75b8151a85cb1a616c',1,'Mat_< unsigned char >::depth()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ae40e39e851f00341f1df57cb482429dc',1,'cv::SparseMat::depth()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#adebe30e83d0c876a63de558ca3ab5435',1,'cv::SparseMat_::depth()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a8511e27bd0093e5dd236df1ef111087a',1,'cv::UMat::depth()'],['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#ga8b5e5413af41caf3f2a0bbf4cdf517a8',1,'cv::sfm::depth()'],['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#ga8b5e5413af41caf3f2a0bbf4cdf517a8',1,'depth(InputArray R, InputArray t, InputArray X)(Global Namespace)']]], + ['depth_20map_20from_20stereo_20images_218',['Depth Map from Stereo Images',['https://docs.opencv.org/4.2.0/dd/d53/tutorial_py_depthmap.html',1,'']]], + ['depth_20processing_219',['RGB-Depth Processing',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html',1,'']]], + ['depth_20sensors_220',['depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors'],['https://docs.opencv.org/4.2.0/d7/d6f/tutorial_kinect_openni.html',1,'Using Kinect and other OpenNI compatible depth sensors']]], + ['depth_2ehpp_221',['depth.hpp',['https://docs.opencv.org/4.2.0/db/d30/depth_8hpp.html',1,'']]], + ['depth_5f_222',['depth_',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a72caa32478e3272b39acce343d0a977d',1,'cv::rgbd::DepthCleaner::depth_'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#adcac1dbf126ec619a8f1b537b1243db7',1,'cv::rgbd::RgbdNormals::depth_']]], + ['depth_5fcleaner_5fimpl_5f_223',['depth_cleaner_impl_',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#ac796d356aa15fd508d986698a1fd132d',1,'cv::rgbd::DepthCleaner']]], + ['depth_5fcleaner_5fmethod_224',['DEPTH_CLEANER_METHOD',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a09e7960316b2f21d6529aa3b937b6185',1,'cv::rgbd::DepthCleaner']]], + ['depth_5fcleaner_5fnil_225',['DEPTH_CLEANER_NIL',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a09e7960316b2f21d6529aa3b937b6185a1d090ec96f4560519c8d5f93693e3a08',1,'cv::rgbd::DepthCleaner']]], + ['depth_5fcomponent_226',['DEPTH_COMPONENT',['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1838399ee67c0957c0ae42cabfa99033ad97d2f204bb7e38b03b74ea3a8129cdb',1,'cv::ogl::Texture2D']]], + ['depth_5fmask_227',['DEPTH_MASK',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa6207c8cf9a3e442f153dc0241aea600a1454580da17d20c8ec5917170dc3da3a',1,'cv::Mat::DEPTH_MASK'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a253082dc73b6e195968b5cd6ad10c71bacbabb2648f797b89bd9ddc77cce0c408',1,'cv::UMat::DEPTH_MASK']]], + ['depth_5fmask_5f16f_228',['DEPTH_MASK_16F',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39ae6f2776fcc4735a6a62ba533b521cce6',1,'cv::_OutputArray']]], + ['depth_5fmask_5f16s_229',['DEPTH_MASK_16S',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39a12fc72b6ad6b7c4c57d43101418c7647',1,'cv::_OutputArray']]], + ['depth_5fmask_5f16u_230',['DEPTH_MASK_16U',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39a37e0a6be8e5e1348653da7afa4374c8a',1,'cv::_OutputArray']]], + ['depth_5fmask_5f32f_231',['DEPTH_MASK_32F',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39ad93b863667cd772d276cd79e5710ec7a',1,'cv::_OutputArray']]], + ['depth_5fmask_5f32s_232',['DEPTH_MASK_32S',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39ae45a3064f674f50ca7b2bbbd891d18db',1,'cv::_OutputArray']]], + ['depth_5fmask_5f64f_233',['DEPTH_MASK_64F',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39ad5a4d24690fc0c25e90caec2a89240d2',1,'cv::_OutputArray']]], + ['depth_5fmask_5f8s_234',['DEPTH_MASK_8S',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39aa632dc99a97d2f95b3e6859c4bcd7070',1,'cv::_OutputArray']]], + ['depth_5fmask_5f8u_235',['DEPTH_MASK_8U',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39add5f87e30d2774e03decfc24692f0a34',1,'cv::_OutputArray']]], + ['depth_5fmask_5fall_236',['DEPTH_MASK_ALL',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39a2fb202d5da299b24f4e532a59233159e',1,'cv::_OutputArray']]], + ['depth_5fmask_5fall_5f16f_237',['DEPTH_MASK_ALL_16F',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39a60b14ad36f03f8b3578e01f31c022e20',1,'cv::_OutputArray']]], + ['depth_5fmask_5fall_5fbut_5f8s_238',['DEPTH_MASK_ALL_BUT_8S',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39a79a72b5eaca571010cf9144b2d5ee795',1,'cv::_OutputArray']]], + ['depth_5fmask_5fflt_239',['DEPTH_MASK_FLT',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39a2c96709be1464f7d027955cfc59c22e4',1,'cv::_OutputArray']]], + ['depthcleaner_240',['DepthCleaner',['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html',1,'cv::rgbd::DepthCleaner'],['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#a0274dd5c53ffef6c22d3ff52c6912173',1,'cv::rgbd::DepthCleaner::DepthCleaner()'],['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#ad62ec7610e9eac63c0ab91f66ea9298e',1,'cv::rgbd::DepthCleaner::DepthCleaner(int depth, int window_size=5, int method=DepthCleaner::DEPTH_CLEANER_NIL)']]], + ['depthfactor_241',['depthFactor',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a6d7b0d32c20ccd1ad0e7ebb5fb59a164',1,'cv::dynafu::Params::depthFactor'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a29c1bbf7801359f77176433ee85bbfae',1,'cv::kinfu::Params::depthFactor']]], + ['depthmask_242',['DepthMask',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a9aa5a028921acff4607a7a5bb370fc39',1,'cv::_OutputArray']]], + ['depthnormal_243',['DepthNormal',['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html',1,'cv::linemod::DepthNormal'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#aba19bc45db26d247e3f945eeeae4ea72',1,'cv::linemod::DepthNormal::DepthNormal()'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#ab396e6f6556c39a9e40d42bb6f5209d4',1,'cv::linemod::DepthNormal::DepthNormal(int distance_threshold, int difference_threshold, size_t num_features, int extract_threshold)']]], + ['depthto3d_244',['depthTo3d',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga403eeb581b09684f7e24f7c157086dd6',1,'cv::rgbd::depthTo3d()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga403eeb581b09684f7e24f7c157086dd6',1,'depthTo3d()(Global Namespace)']]], + ['depthto3dsparse_245',['depthTo3dSparse',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga76a9cadc808e7262f391d94fdc262b9e',1,'cv::rgbd::depthTo3dSparse()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga76a9cadc808e7262f391d94fdc262b9e',1,'depthTo3dSparse()(Global Namespace)']]], + ['depthtostring_246',['depthToString',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a5abb3fb83453e4b89ced1ec07bf9a313',1,'cv']]], + ['deque_247',['deque',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08839.html',1,'std::__debug::deque< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09107.html',1,'std::__profile::deque< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html',1,'std::deque< _Tp, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00062.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ae68c6ac05cd6e788a90c9b8a47c56756',1,'deque< _StateSeqT >::deque()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#aa8cf87c79a7c6bdf2cf07749fb1e2ff5',1,'deque< _StateSeqT >::deque(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a511a8f76d058f6bd0e2236abf8df23bc',1,'deque< _StateSeqT >::deque(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a858d7660a45a911f8ae7858246ea2f6d',1,'deque< _StateSeqT >::deque(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a03515a6af7f959e28cec591ac5f0f8b2',1,'deque< _StateSeqT >::deque(const deque &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a7d533f573a77a0f9bf33fa40dde1c9cd',1,'deque< _StateSeqT >::deque(deque &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0948ee096c5387c1deb1e5885d06c112',1,'deque< _StateSeqT >::deque(const deque &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0bb7da7a228f22622f2e822252813d51',1,'deque< _StateSeqT >::deque(deque &&__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#abdc5fd34432d73edde92643c58d7db6d',1,'deque< _StateSeqT >::deque(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ac11b72c35c99798a8aa8428206af7b74',1,'deque< _StateSeqT >::deque(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ae68c6ac05cd6e788a90c9b8a47c56756',1,'std::deque::deque()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#aa8cf87c79a7c6bdf2cf07749fb1e2ff5',1,'std::deque::deque(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a511a8f76d058f6bd0e2236abf8df23bc',1,'std::deque::deque(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a858d7660a45a911f8ae7858246ea2f6d',1,'std::deque::deque(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a03515a6af7f959e28cec591ac5f0f8b2',1,'std::deque::deque(const deque &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a7d533f573a77a0f9bf33fa40dde1c9cd',1,'std::deque::deque(deque &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0948ee096c5387c1deb1e5885d06c112',1,'std::deque::deque(const deque &__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0bb7da7a228f22622f2e822252813d51',1,'std::deque::deque(deque &&__x, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#abdc5fd34432d73edde92643c58d7db6d',1,'std::deque::deque(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ac11b72c35c99798a8aa8428206af7b74',1,'std::deque::deque(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())']]], + ['deque_2etcc_248',['deque.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00320.html',1,'']]], + ['deque_3c_20_5fstateseqt_20_3e_249',['deque< _StateSeqT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html',1,'']]], + ['deque_3c_20std_3a_3apair_3c_20uint64_5ft_2c_20uint32_5ft_20_3e_20_3e_250',['deque< std::pair< uint64_t, uint32_t > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html',1,'std']]], + ['deque_3c_20trackedobject_20_3e_251',['deque< TrackedObject >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html',1,'std']]], + ['deriche_5ffilter_2ehpp_252',['deriche_filter.hpp',['https://docs.opencv.org/4.2.0/d4/d71/deriche__filter_8hpp.html',1,'']]], + ['deriv_2ehpp_253',['deriv.hpp',['https://docs.opencv.org/4.2.0/df/d27/expr_2deriv_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/da3/ptr2d_2deriv_8hpp.html',1,'(Global Namespace)']]], + ['derivaperture_254',['derivAperture',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a128efda1c45dee2a989547c7b41e6a95',1,'cv::HOGDescriptor']]], + ['derivated_20tools_255',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], + ['derivatives_256',['Sobel Derivatives',['https://docs.opencv.org/4.2.0/d2/d2c/tutorial_sobel_derivatives.html',1,'']]], + ['derived_257',['derived',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'Eigen::EigenBase::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'Eigen::EigenBase::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< FullPivLU< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< FullPivLU< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< HouseholderQR< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< HouseholderQR< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< Inverse< PermutationType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< Inverse< PermutationType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< LLT< _MatrixType, _UpLo > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< LLT< _MatrixType, _UpLo > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< PartialPivLU< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< PartialPivLU< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< PermutationWrapper< _IndicesType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< PermutationWrapper< _IndicesType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SVDBase< Derived > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SVDBase< Derived > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< Transpose< MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< Transpose< MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::derived() const'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'EigenBase< TriangularView< MatrixType, Mode > >::derived()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'EigenBase< TriangularView< MatrixType, Mode > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'Eigen::SolverBase::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'Eigen::SolverBase::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< FullPivLU< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< FullPivLU< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< HouseholderQR< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< HouseholderQR< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< LLT< _MatrixType, _UpLo > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< LLT< _MatrixType, _UpLo > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< PartialPivLU< _MatrixType > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< PartialPivLU< _MatrixType > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< SVDBase< Derived > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< SVDBase< Derived > >::derived() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a1fbabe7f12bcbfba3b9a448b1f5e46fa',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::derived()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#afd4f3f1c57b7594b96a7e30f2974ea2e',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::derived() const']]], + ['derivx_5f_258',['derivX_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad015a0cf893db11d5e79a3fd60ae6d31',1,'cv::cudev::derivX_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad015a0cf893db11d5e79a3fd60ae6d31',1,'derivX_()(Global Namespace)']]], + ['derivxptr_259',['DerivXPtr',['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1cudev_1_1DerivXPtr.html',1,'cv::cudev']]], + ['derivxptr_260',['derivXPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7870c12342ebf45961b67757fdca23e',1,'cv::cudev::derivXPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7870c12342ebf45961b67757fdca23e',1,'derivXPtr()(Global Namespace)']]], + ['derivxptrsz_261',['DerivXPtrSz',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1cudev_1_1DerivXPtrSz.html',1,'cv::cudev']]], + ['derivy_5f_262',['derivY_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c290d1fa976dbd6901329f65a218766',1,'cv::cudev::derivY_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c290d1fa976dbd6901329f65a218766',1,'derivY_()(Global Namespace)']]], + ['derivyptr_263',['DerivYPtr',['https://docs.opencv.org/4.2.0/dc/d51/structcv_1_1cudev_1_1DerivYPtr.html',1,'cv::cudev']]], + ['derivyptr_264',['derivYPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga291c6ce7a6ec669ee01de73bd0db47b7',1,'cv::cudev::derivYPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga291c6ce7a6ec669ee01de73bd0db47b7',1,'derivYPtr()(Global Namespace)']]], + ['derivyptrsz_265',['DerivYPtrSz',['https://docs.opencv.org/4.2.0/d2/dfc/structcv_1_1cudev_1_1DerivYPtrSz.html',1,'cv::cudev']]], + ['desc_266',['desc',['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#a1136fc28a28da350d53f3332769c25a2',1,'cv::gapi::ie::Params']]], + ['desc_5fnpca_267',['desc_npca',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a92346cbad37a3b82924f422d70261a65',1,'cv::TrackerKCF::Params']]], + ['desc_5fpca_268',['desc_pca',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a478cf7e3a32518b4003f26624bd02680',1,'cv::TrackerKCF::Params']]], + ['descr_5fformat_5fcol_5fby_5fcol_269',['DESCR_FORMAT_COL_BY_COL',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a0931e149238b27ba63357cbde12dcf1aae896332fd7b76bda217f50049f74d4db',1,'cv::HOGDescriptor']]], + ['descr_5fformat_5frow_5fby_5frow_270',['DESCR_FORMAT_ROW_BY_ROW',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a0931e149238b27ba63357cbde12dcf1aa1a8f620a538dee55bf8c8d0c06fb62aa',1,'cv::HOGDescriptor']]], + ['descr_5fof_271',['descr_of',['https://docs.opencv.org/4.2.0/dd/d1c/classcv_1_1gapi_1_1wip_1_1GCaptureSource.html#ad92fceb8177f0fb129137f35d50dce93',1,'cv::gapi::wip::GCaptureSource::descr_of()'],['https://docs.opencv.org/4.2.0/da/d03/classcv_1_1gapi_1_1wip_1_1IStreamSource.html#a183343b6247b7a4ec24e8ec795795611',1,'cv::gapi::wip::IStreamSource::descr_of()'],['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html#a73c4a2badc87649fe4e86f29276258ec',1,'cv::detail::VectorRef::descr_of()'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga0d1b4f7d1dbc43b5ac9ddd6454348f0c',1,'cv::descr_of(const std::vector< U > &)'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#gabbf80cc9bfd0c3d488e387be16640851',1,'cv::descr_of(const cv::Scalar &scalar)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a4ca22b87ab820eabc7131c3aee9772b1',1,'cv::descr_of(const cv::gapi::own::Scalar &scalar)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a20929f881a7bc75ea132fe75b364cb86',1,'cv::descr_of(const GRunArg &arg)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a4b8e663ec9d66a2e5f35fec1d77b4b63',1,'cv::descr_of(const GRunArgs &args)'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga9f0311186061ecb4250c25ec388fbecc',1,'cv::descr_of(const cv::Mat &mat)'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#gaab82cc8af201a0634401cfff3e5f6ed8',1,'cv::descr_of(const cv::UMat &mat)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a6addd09dba37c9c7fb2cbd58beb6d5cc',1,'cv::gapi::own::descr_of()'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga0d1b4f7d1dbc43b5ac9ddd6454348f0c',1,'descr_of(const std::vector< U > &)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#gabbf80cc9bfd0c3d488e387be16640851',1,'descr_of(const cv::Scalar &scalar)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga9f0311186061ecb4250c25ec388fbecc',1,'descr_of(const cv::Mat &mat)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#gaab82cc8af201a0634401cfff3e5f6ed8',1,'descr_of(const cv::UMat &mat)(Global Namespace)']]], + ['description_272',['Description',['https://docs.opencv.org/4.2.0/d5/dde/tutorial_feature_description.html',1,'Feature Description'],['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/db/d27/tutorial_py_table_of_contents_feature2d.html',1,'Feature Detection and Description']]], ['description_273',['description',['https://docs.opencv.org/4.2.0/dd/db9/structcv_1_1GTransform.html#a729d054f574159f6df0566c3441e316a',1,'cv::GTransform::description'],['../structcam_1_1CameraConfig.html#a02750e59124c363e3be74667c1ea417b',1,'cam::CameraConfig::description']]], - ['description_274',['Description',['https://docs.opencv.org/4.2.0/d5/dde/tutorial_feature_description.html',1,'Feature Description'],['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/db/d27/tutorial_py_table_of_contents_feature2d.html',1,'Feature Detection and Description']]], - ['descriptor_275',['Descriptor',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a15c1223cbc07ddba4320a32485c06fbb',1,'cv::tbm::ITrackerByMatching']]], - ['descriptor_20matchers_276',['Descriptor Matchers',['https://docs.opencv.org/4.2.0/d8/d9b/group__features2d__match.html',1,'']]], - ['descriptor_2ehpp_277',['descriptor.hpp',['https://docs.opencv.org/4.2.0/db/d82/line__descriptor_2include_2opencv2_2line__descriptor_2descriptor_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/db0/stereo_2include_2opencv2_2stereo_2descriptor_8hpp.html',1,'(Global Namespace)']]], - ['descriptor_5ffast_278',['descriptor_fast',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#ac7d85e89d678229a14c1f9e7520ff31a',1,'cv::tbm::Track']]], - ['descriptor_5fkaze_279',['DESCRIPTOR_KAZE',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a6f44619b9c9a25be4526de5b665ca690af0a596e13c7fae0498948e093de1e9d0',1,'cv::AKAZE']]], - ['descriptor_5fkaze_5fupright_280',['DESCRIPTOR_KAZE_UPRIGHT',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a6f44619b9c9a25be4526de5b665ca690a891bb40908c2bdb120e39c93ca0da33d',1,'cv::AKAZE']]], - ['descriptor_5fmldb_281',['DESCRIPTOR_MLDB',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a6f44619b9c9a25be4526de5b665ca690a929fb7e01bc6a4e8e7a1449ee0731c86',1,'cv::AKAZE']]], - ['descriptor_5fmldb_5fupright_282',['DESCRIPTOR_MLDB_UPRIGHT',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a6f44619b9c9a25be4526de5b665ca690a5b8054d5bfac5aa96728d171d86080c1',1,'cv::AKAZE']]], - ['descriptor_5fstrong_283',['descriptor_strong',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a30797f44fc974341ce2290660bf5cc16',1,'cv::tbm::Track']]], - ['descriptorcollection_284',['DescriptorCollection',['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html',1,'cv::DescriptorMatcher::DescriptorCollection'],['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a38c134797d73b03f1fad50dc70b924b3',1,'cv::DescriptorMatcher::DescriptorCollection::DescriptorCollection()'],['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a74e17960bca4e1343f0111ecb844309a',1,'cv::DescriptorMatcher::DescriptorCollection::DescriptorCollection(const DescriptorCollection &collection)']]], + ['descriptor_274',['Descriptor',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a15c1223cbc07ddba4320a32485c06fbb',1,'cv::tbm::ITrackerByMatching']]], + ['descriptor_20matchers_275',['Descriptor Matchers',['https://docs.opencv.org/4.2.0/d8/d9b/group__features2d__match.html',1,'']]], + ['descriptor_2ehpp_276',['descriptor.hpp',['https://docs.opencv.org/4.2.0/db/d82/line__descriptor_2include_2opencv2_2line__descriptor_2descriptor_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/db0/stereo_2include_2opencv2_2stereo_2descriptor_8hpp.html',1,'(Global Namespace)']]], + ['descriptor_5ffast_277',['descriptor_fast',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#ac7d85e89d678229a14c1f9e7520ff31a',1,'cv::tbm::Track']]], + ['descriptor_5fkaze_278',['DESCRIPTOR_KAZE',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a6f44619b9c9a25be4526de5b665ca690af0a596e13c7fae0498948e093de1e9d0',1,'cv::AKAZE']]], + ['descriptor_5fkaze_5fupright_279',['DESCRIPTOR_KAZE_UPRIGHT',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a6f44619b9c9a25be4526de5b665ca690a891bb40908c2bdb120e39c93ca0da33d',1,'cv::AKAZE']]], + ['descriptor_5fmldb_280',['DESCRIPTOR_MLDB',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a6f44619b9c9a25be4526de5b665ca690a929fb7e01bc6a4e8e7a1449ee0731c86',1,'cv::AKAZE']]], + ['descriptor_5fmldb_5fupright_281',['DESCRIPTOR_MLDB_UPRIGHT',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a6f44619b9c9a25be4526de5b665ca690a5b8054d5bfac5aa96728d171d86080c1',1,'cv::AKAZE']]], + ['descriptor_5fstrong_282',['descriptor_strong',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a30797f44fc974341ce2290660bf5cc16',1,'cv::tbm::Track']]], + ['descriptorcollection_283',['DescriptorCollection',['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html',1,'cv::DescriptorMatcher::DescriptorCollection'],['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a38c134797d73b03f1fad50dc70b924b3',1,'cv::DescriptorMatcher::DescriptorCollection::DescriptorCollection()'],['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a74e17960bca4e1343f0111ecb844309a',1,'cv::DescriptorMatcher::DescriptorCollection::DescriptorCollection(const DescriptorCollection &collection)']]], + ['descriptorextractor_284',['DescriptorExtractor',['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#gadd5cf7c76865f14468cfdd9cc08eb990',1,'cv::DescriptorExtractor'],['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#gadd5cf7c76865f14468cfdd9cc08eb990',1,'DescriptorExtractor(Global Namespace)']]], ['descriptorextractor_285',['descriptorExtractor',['https://docs.opencv.org/4.2.0/d7/d8d/classcv_1_1cnn__3dobj_1_1descriptorExtractor.html',1,'cv::cnn_3dobj::descriptorExtractor'],['https://docs.opencv.org/4.2.0/d7/d8d/classcv_1_1cnn__3dobj_1_1descriptorExtractor.html#af873e68d42803decc9a469dd34bcf5c5',1,'cv::cnn_3dobj::descriptorExtractor::descriptorExtractor()']]], - ['descriptorextractor_286',['DescriptorExtractor',['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#gadd5cf7c76865f14468cfdd9cc08eb990',1,'cv::DescriptorExtractor'],['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#gadd5cf7c76865f14468cfdd9cc08eb990',1,'DescriptorExtractor(Global Namespace)']]], - ['descriptorfast_287',['descriptorFast',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#acb88f6e42ea72307bb6fec917a53e8ea',1,'cv::tbm::ITrackerByMatching']]], - ['descriptormatcher_288',['DescriptorMatcher',['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html',1,'cv::cuda::DescriptorMatcher'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html',1,'cv::DescriptorMatcher']]], + ['descriptorfast_286',['descriptorFast',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#acb88f6e42ea72307bb6fec917a53e8ea',1,'cv::tbm::ITrackerByMatching']]], + ['descriptormatcher_287',['DescriptorMatcher',['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html',1,'cv::cuda::DescriptorMatcher'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html',1,'cv::DescriptorMatcher']]], + ['descriptors_288',['Descriptors',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html',1,'G-API Metadata Descriptors'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'Structural Analysis and Shape Descriptors']]], ['descriptors_289',['descriptors',['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#a2a447f969feed258bd3cdfc521bc9502',1,'cv::BOWTrainer::descriptors'],['https://docs.opencv.org/4.2.0/d4/db5/structcv_1_1detail_1_1ImageFeatures.html#a7c794befb9b8a67bf363fd9fad7b8870',1,'cv::detail::ImageFeatures::descriptors'],['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html',1,'Fourier descriptors']]], - ['descriptors_290',['Descriptors',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html',1,'G-API Metadata Descriptors'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'Structural Analysis and Shape Descriptors']]], - ['descriptors_20for_20lines_20extracted_20from_20an_20image_291',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], - ['descriptorscount_292',['descriptorsCount',['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#a3336e4c738c273482d1bf2cc2b6b5829',1,'cv::BOWTrainer']]], - ['descriptorsize_293',['descriptorSize',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#ad2dd36979e2f83c6be1d9be6b69d5cf6',1,'cv::line_descriptor::BinaryDescriptor::descriptorSize()'],['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#a0f41a68e3326e1bffd2f32aa64a9871d',1,'cv::BOWImgDescriptorExtractor::descriptorSize()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#ae9e03d8657032baa5ecc1368e5adc7a7',1,'cv::Feature2D::descriptorSize()'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a5a3135dc3e37160ecd54e05487243729',1,'cv::cuda::SURF_CUDA::descriptorSize()']]], - ['descriptorstorageformat_294',['DescriptorStorageFormat',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a0931e149238b27ba63357cbde12dcf1a',1,'cv::HOGDescriptor']]], - ['descriptorstrong_295',['descriptorStrong',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a9283fa779d9e8215b3caed12c4f53548',1,'cv::tbm::ITrackerByMatching']]], + ['descriptors_20for_20lines_20extracted_20from_20an_20image_290',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], + ['descriptorscount_291',['descriptorsCount',['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html#a3336e4c738c273482d1bf2cc2b6b5829',1,'cv::BOWTrainer']]], + ['descriptorsize_292',['descriptorSize',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#ad2dd36979e2f83c6be1d9be6b69d5cf6',1,'cv::line_descriptor::BinaryDescriptor::descriptorSize()'],['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#a0f41a68e3326e1bffd2f32aa64a9871d',1,'cv::BOWImgDescriptorExtractor::descriptorSize()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#ae9e03d8657032baa5ecc1368e5adc7a7',1,'cv::Feature2D::descriptorSize()'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a5a3135dc3e37160ecd54e05487243729',1,'cv::cuda::SURF_CUDA::descriptorSize()']]], + ['descriptorstorageformat_293',['DescriptorStorageFormat',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a0931e149238b27ba63357cbde12dcf1a',1,'cv::HOGDescriptor']]], + ['descriptorstrong_294',['descriptorStrong',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a9283fa779d9e8215b3caed12c4f53548',1,'cv::tbm::ITrackerByMatching']]], + ['descriptortype_295',['DescriptorType',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a6f44619b9c9a25be4526de5b665ca690',1,'cv::AKAZE']]], ['descriptortype_296',['descriptorType',['https://docs.opencv.org/4.2.0/d1/dcc/structcv_1_1optflow_1_1GPCTrainingParams.html#ab9ad4f810ff813b3369fc996842818ca',1,'cv::optflow::GPCTrainingParams::descriptorType'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a4fbbc700686c45a27dca32c705e78c1b',1,'cv::line_descriptor::BinaryDescriptor::descriptorType()'],['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#a4abb4c684a25f843b2f033f2bc7f52eb',1,'cv::BOWImgDescriptorExtractor::descriptorType()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a54e6b0fa61e69398f3cff77800e142cb',1,'cv::Feature2D::descriptorType()']]], - ['descriptortype_297',['DescriptorType',['https://docs.opencv.org/4.2.0/d8/d30/classcv_1_1AKAZE.html#a6f44619b9c9a25be4526de5b665ca690',1,'cv::AKAZE']]], - ['descrs_5fof_298',['descrs_of',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#aed6fe09a22fb5c37efd40b3446febb8f',1,'cv::descrs_of(const std::vector< cv::Mat > &vec)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a32ec103291faa0b7f1861e5571f1528b',1,'cv::descrs_of(const std::vector< cv::UMat > &vec)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a905279ccee2a6a4f48eae70f6021581f',1,'cv::gapi::own::descrs_of()']]], - ['design_20overview_299',['High-level design overview',['https://docs.opencv.org/4.2.0/de/d4d/gapi_hld.html',1,'']]], - ['destroy_300',['destroy',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#ac553ef7e1763033aedf0440dd7abed3d',1,'cv::Allocator::destroy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a38ff516ec60a94927ff485a81136a4da',1,'__alloc_traits< _Tp_alloc_type >::destroy(_Tp_alloc_type &__a, _Tp *__p) noexcept(noexcept(_S_destroy(__a, __p, 0)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a38ff516ec60a94927ff485a81136a4da',1,'__alloc_traits< _Tp_alloc_type >::destroy(_Tp_alloc_type &__a, _Tp *__p) noexcept(noexcept(_S_destroy(__a, __p, 0)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a38ff516ec60a94927ff485a81136a4da',1,'__gnu_cxx::__alloc_traits::destroy(_Alloc &__a, _Tp *__p) noexcept(noexcept(_S_destroy(__a, __p, 0)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a38ff516ec60a94927ff485a81136a4da',1,'__gnu_cxx::__alloc_traits::destroy(_Alloc &__a, _Tp *__p) noexcept(noexcept(_S_destroy(__a, __p, 0)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a38ff516ec60a94927ff485a81136a4da',1,'allocator_traits< _Tp_alloc_type >::destroy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a38ff516ec60a94927ff485a81136a4da',1,'std::allocator_traits::destroy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a1c5d9f61f7a45ae22097e147c0a56d5f',1,'std::allocator_traits< allocator< _Tp > >::destroy()']]], - ['destroyallwindows_301',['destroyAllWindows',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga6b7fc1c1a8960438156912027b38f481',1,'cv::destroyAllWindows()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga6b7fc1c1a8960438156912027b38f481',1,'destroyAllWindows()(Global Namespace)']]], - ['destroyflann_302',['destroyFlann',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga439450ce38dae0b87bf497c50d6211e9',1,'cv::ppf_match_3d::destroyFlann()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga439450ce38dae0b87bf497c50d6211e9',1,'destroyFlann()(Global Namespace)']]], - ['destroywindow_303',['destroyWindow',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga851ccdd6961022d1d5b4c4f255dbab34',1,'cv::destroyWindow()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga851ccdd6961022d1d5b4c4f255dbab34',1,'destroyWindow()(Global Namespace)']]], - ['det_304',['det',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#ad810e03e0ed2e12d738648eaca2540c1',1,'cv::cuda::SURF_CUDA']]], - ['detachdata_305',['detachData',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#aa40ccce3dca12ada46d0f02d99866690',1,'cv::TLSDataAccumulator::detachData()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#aa40ccce3dca12ada46d0f02d99866690',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::detachData()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#a218e191c933c04e57c3f05b6525c9800',1,'cv::TLSDataContainer::detachData()']]], - ['detail_3a_3aexternal_5fconstructor_306',['external_constructor',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6275ed57bae6866cdf5db5370a7ad47c.html#a6275ed57bae6866cdf5db5370a7ad47c',1,'nlohmann::basic_json']]], - ['detailenhance_307',['detailEnhance',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ga0de660cb6f371a464a74c7b651415975',1,'cv::detailEnhance()'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ga0de660cb6f371a464a74c7b651415975',1,'detailEnhance(InputArray src, OutputArray dst, float sigma_s=10, float sigma_r=0.15f)(Global Namespace)']]], - ['details_308',['Implementation details',['https://docs.opencv.org/4.2.0/d4/ddd/gapi_impl.html',1,'']]], - ['detect_309',['detect',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1xfeatures2d_1_1AffineFeature2D.html#ad5b29ff43bad6c2dc4d18df9843f3ad7',1,'cv::xfeatures2d::AffineFeature2D::detect()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a64ab14e3d9878232bcb33baa50e2d3e3',1,'cv::line_descriptor::BinaryDescriptor::detect(const Mat &image, std::vector< KeyLine > &keypoints, const Mat &mask=Mat())'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a10aa6eae160d52654983880b83e6fbd2',1,'cv::line_descriptor::BinaryDescriptor::detect(const std::vector< Mat > &images, std::vector< std::vector< KeyLine > > &keylines, const std::vector< Mat > &masks=std::vector< Mat >()) const'],['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html#a6438cf8453f2dfd6703ceb50056de309',1,'cv::cuda::CannyEdgeDetector::detect(InputArray image, OutputArray edges, Stream &stream=Stream::Null())=0'],['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html#aa699764fed242de08abe97f6ee06a599',1,'cv::cuda::CannyEdgeDetector::detect(InputArray dx, InputArray dy, OutputArray edges, Stream &stream=Stream::Null())=0'],['https://docs.opencv.org/4.2.0/de/d95/classcv_1_1cuda_1_1CornersDetector.html#a3a103ca6d48c51840d31397730a692aa',1,'cv::cuda::CornersDetector::detect()'],['https://docs.opencv.org/4.2.0/d3/df1/classcv_1_1dnn_1_1DetectionModel.html#aca8d52a761b41576e3798b1a92e70a9a',1,'cv::dnn::DetectionModel::detect()'],['https://docs.opencv.org/4.2.0/df/dba/classcv_1_1dpm_1_1DPMDetector.html#aedf0cc6120afb1142d7e402b667791df',1,'cv::dpm::DPMDetector::detect()'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1ximgproc_1_1FastLineDetector.html#a10d3ce6ef6bce92818d1f919e2b2aa57',1,'cv::ximgproc::FastLineDetector::detect()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#aa4e9a7082ec61ebc108806704fbd7887',1,'cv::Feature2D::detect(InputArray image, std::vector< KeyPoint > &keypoints, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a5968e9bc8497a8eb845272b9442559f3',1,'cv::Feature2D::detect(InputArrayOfArrays images, std::vector< std::vector< KeyPoint > > &keypoints, InputArrayOfArrays masks=noArray())'],['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a42efe58575412b02c1a6642fe5b22d5b',1,'cv::GeneralizedHough::detect(InputArray image, OutputArray positions, OutputArray votes=noArray())=0'],['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a07fc9a22f1a97b9dbe29c879c6efe803',1,'cv::GeneralizedHough::detect(InputArray edges, InputArray dx, InputArray dy, OutputArray positions, OutputArray votes=noArray())=0'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a6673d9c05926ea11e0070c8ee4145664',1,'cv::cuda::HOG::detect()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a5851df61c5b95391533144c078403672',1,'cv::HOGDescriptor::detect(InputArray img, std::vector< Point > &foundLocations, std::vector< double > &weights, double hitThreshold=0, Size winStride=Size(), Size padding=Size(), const std::vector< Point > &searchLocations=std::vector< Point >()) const'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a309829908ffaf4645755729d7aa90627',1,'cv::HOGDescriptor::detect(InputArray img, std::vector< Point > &foundLocations, double hitThreshold=0, Size winStride=Size(), Size padding=Size(), const std::vector< Point > &searchLocations=std::vector< Point >()) const'],['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#ae4c9aa668b46bb497175af3c15b34f72',1,'cv::cuda::HoughCirclesDetector::detect()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#a18ff6d0886833ac6215054e191ae2520',1,'cv::cuda::HoughLinesDetector::detect()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html#a739bf84825ca455966d69dd75ca0ea6e',1,'cv::cuda::HoughSegmentDetector::detect()'],['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#ae613e0c9a09698523280299e1bb02b5d',1,'cv::DetectionBasedTracker::IDetector::detect()'],['https://docs.opencv.org/4.2.0/db/d73/classcv_1_1LineSegmentDetector.html#a1bbd8f90f6feb4d673d1a1bc614a667c',1,'cv::LineSegmentDetector::detect()'],['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#aedaabd0a9c1c465c5b7d80b67374a73b',1,'cv::line_descriptor::LSDDetector::detect(const Mat &image, std::vector< KeyLine > &keypoints, int scale, int numOctaves, const Mat &mask=Mat())'],['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#a30ee653e83fed71ec048050619b2f469',1,'cv::line_descriptor::LSDDetector::detect(const std::vector< Mat > &images, std::vector< std::vector< KeyLine > > &keylines, int scale, int numOctaves, const std::vector< Mat > &masks=std::vector< Mat >()) const'],['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a64373f7d877d27473f64fe04bb57d22b',1,'cv::QRCodeDetector::detect()'],['https://docs.opencv.org/4.2.0/de/d25/classcv_1_1text_1_1TextDetector.html#a01b63eca18aca77d9d4e2ce5e8f76bac',1,'cv::text::TextDetector::detect()'],['https://docs.opencv.org/4.2.0/d1/d66/classcv_1_1text_1_1TextDetectorCNN.html#ac935f5cbfc3305784626d2fa4e49bb25',1,'cv::text::TextDetectorCNN::detect()'],['https://docs.opencv.org/4.2.0/de/d0e/classcv_1_1xobjdetect_1_1WBDetector.html#ad19680e6545f49a9ca42dfc3457319e2',1,'cv::xobjdetect::WBDetector::detect()']]], - ['detect_5fthresh_310',['detect_thresh',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#af7c297a918719441a448181626488eb0',1,'cv::TrackerKCF::Params']]], - ['detectandcompute_311',['detectAndCompute',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1xfeatures2d_1_1AffineFeature2D.html#a96d437af348dc676a3860d755555a249',1,'cv::xfeatures2d::AffineFeature2D::detectAndCompute()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a8be0d1c20b08eb867184b8d74c15a677',1,'cv::Feature2D::detectAndCompute()']]], - ['detectandcomputeasync_312',['detectAndComputeAsync',['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1cuda_1_1Feature2DAsync.html#a56c6c75e25e9616934c25552164a363c',1,'cv::cuda::Feature2DAsync']]], - ['detectanddecode_313',['detectAndDecode',['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a7290bd6a5d59b14a37979c3a14fbf394',1,'cv::QRCodeDetector']]], - ['detectasync_314',['detectAsync',['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1cuda_1_1Feature2DAsync.html#ae8e813808fdd7c647c39312d4fbe89b1',1,'cv::cuda::Feature2DAsync']]], - ['detectcharucodiamond_315',['detectCharucoDiamond',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gaade474aa951d02470c34ddbb91d851ea',1,'cv::aruco::detectCharucoDiamond()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gaade474aa951d02470c34ddbb91d851ea',1,'detectCharucoDiamond()(Global Namespace)']]], - ['detected_316',['DETECTED',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ad43563cc5b954817ad5078f995afd3ffa9828525838cee9776655ebbd2211d3e7',1,'cv::DetectionBasedTracker']]], - ['detected_5fnot_5fshown_5fyet_317',['DETECTED_NOT_SHOWN_YET',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ad43563cc5b954817ad5078f995afd3ffab57bc255a72bcaa7b49c2c3c6b4257d7',1,'cv::DetectionBasedTracker']]], - ['detected_5ftemporary_5flost_318',['DETECTED_TEMPORARY_LOST',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ad43563cc5b954817ad5078f995afd3ffa6d5ec140e9ee103752c5356d95504694',1,'cv::DetectionBasedTracker']]], - ['detectedges_319',['detectEdges',['https://docs.opencv.org/4.2.0/d8/d54/classcv_1_1ximgproc_1_1StructuredEdgeDetection.html#a1f01d212a7d86da6811e85c1b5b17385',1,'cv::ximgproc::StructuredEdgeDetection']]], - ['detectimpl_320',['detectImpl',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a53b8eab4609b8ee0b49f294d7aef5672',1,'cv::line_descriptor::BinaryDescriptor']]], - ['detecting_20corners_20location_20in_20subpixels_321',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], - ['detectinregion_322',['detectInRegion',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a60322c607da2e8cc127fac6c0461394d',1,'cv::DetectionBasedTracker']]], - ['detectinvertedmarker_323',['detectInvertedMarker',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#acc98709d31f1b86c31b18c7200b60909',1,'cv::aruco::DetectorParameters']]], - ['detection_324',['Detection',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html',1,'ArUco Marker Detection'],['https://docs.opencv.org/4.2.0/da/d22/tutorial_py_canny.html',1,'Canny Edge Detection'],['https://docs.opencv.org/4.2.0/d7/de1/tutorial_js_canny.html',1,'Canny Edge Detection']]], - ['detection_325',['detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'DNN used for object detection'],['https://docs.opencv.org/4.2.0/d4/d54/group__xobjdetect.html',1,'Extended object detection'],['https://docs.opencv.org/4.2.0/d1/d52/tutorial_face_swapping_face_landmark_detection.html',1,'Face swapping using face landmark detection']]], - ['detection_326',['Detection',['https://docs.opencv.org/4.2.0/df/d0c/tutorial_py_fast.html',1,'FAST Algorithm for Corner Detection'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/d7/d66/tutorial_feature_detection.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/dc/d0d/tutorial_py_features_harris.html',1,'Harris Corner Detection'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d9/d3f/group__cudaobjdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d9/de5/tutorial_py_table_of_contents_objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/dc/d73/tutorial_js_table_of_contents_objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html',1,'Pedestrian Detection'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html',1,'Scene Text Detection']]], - ['detection_327',['detection',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html',1,'Structured forests for fast edge detection'],['https://docs.opencv.org/4.2.0/d0/da5/tutorial_ximgproc_prediction.html',1,'Structured forests for fast edge detection']]], - ['detection_20and_20description_328',['Detection and Description',['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/db/d27/tutorial_py_table_of_contents_feature2d.html',1,'Feature Detection and Description']]], - ['detection_20and_20recognition_329',['Scene Text Detection and Recognition',['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'']]], - ['detection_20aruco_20module_330',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], - ['detection_20in_20a_20video_331',['Face landmark detection in a video',['https://docs.opencv.org/4.2.0/d8/d3c/tutorial_face_landmark_detection_in_video.html',1,'']]], - ['detection_20in_20an_20image_332',['Face landmark detection in an image',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'']]], - ['detection_20in_20video_20capture_333',['Face Detection in Video Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'']]], - ['detection_20objdetect_20module_334',['Object Detection (objdetect module)',['https://docs.opencv.org/4.2.0/d2/d64/tutorial_table_of_content_objdetect.html',1,'']]], - ['detection_20of_20aruco_20boards_335',['Detection of ArUco Boards',['https://docs.opencv.org/4.2.0/db/da9/tutorial_aruco_board_detection.html',1,'']]], - ['detection_20of_20aruco_20markers_336',['Detection of ArUco Markers',['https://docs.opencv.org/4.2.0/d5/dae/tutorial_aruco_detection.html',1,'']]], - ['detection_20of_20charuco_20corners_337',['Detection of ChArUco Corners',['https://docs.opencv.org/4.2.0/df/d4a/tutorial_charuco_detection.html',1,'']]], - ['detection_20of_20diamond_20markers_338',['Detection of Diamond Markers',['https://docs.opencv.org/4.2.0/d5/d07/tutorial_charuco_diamond_detection.html',1,'']]], - ['detection_20of_20planar_20objects_339',['Detection of planar objects',['https://docs.opencv.org/4.2.0/dd/dd4/tutorial_detection_of_planar_objects.html',1,'']]], - ['detection_20using_20cnns_340',['Object Detection using CNNs',['https://docs.opencv.org/4.2.0/d2/da2/tutorial_dnn_objdetect.html',1,'']]], - ['detection_20using_20haar_20cascades_341',['Detection using Haar Cascades',['https://docs.opencv.org/4.2.0/d7/d8b/tutorial_py_face_detection.html',1,'Face Detection using Haar Cascades'],['https://docs.opencv.org/4.2.0/d2/d99/tutorial_js_face_detection.html',1,'Face Detection using Haar Cascades']]], - ['detection_5fbased_5ftracker_2ehpp_342',['detection_based_tracker.hpp',['https://docs.opencv.org/4.2.0/d5/d5a/detection__based__tracker_8hpp.html',1,'']]], - ['detection_5fof_5fplanar_5fobjects_2emarkdown_343',['detection_of_planar_objects.markdown',['https://docs.opencv.org/4.2.0/dd/d5c/detection__of__planar__objects_8markdown.html',1,'']]], - ['detectionbasedtracker_344',['DetectionBasedTracker',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html',1,'cv::DetectionBasedTracker'],['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#aab415fa71206b900ad52ae650ab96636',1,'cv::DetectionBasedTracker::DetectionBasedTracker()']]], - ['detectionmodel_345',['DetectionModel',['https://docs.opencv.org/4.2.0/d3/df1/classcv_1_1dnn_1_1DetectionModel.html',1,'cv::dnn::DetectionModel'],['https://docs.opencv.org/4.2.0/d3/df1/classcv_1_1dnn_1_1DetectionModel.html#a17cf756617d807631640bdc6ff294ed6',1,'cv::dnn::DetectionModel::DetectionModel(const String &model, const String &config="")'],['https://docs.opencv.org/4.2.0/d3/df1/classcv_1_1dnn_1_1DetectionModel.html#af931afb45587f22a60227434f2babab5',1,'cv::dnn::DetectionModel::DetectionModel(const Net &network)']]], - ['detectionoutputlayer_346',['DetectionOutputLayer',['https://docs.opencv.org/4.2.0/da/dbd/classcv_1_1dnn_1_1DetectionOutputLayer.html',1,'cv::dnn']]], - ['detectionroi_347',['DetectionROI',['https://docs.opencv.org/4.2.0/d3/d34/structcv_1_1DetectionROI.html',1,'cv']]], - ['detections_348',['detections',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a538ca4168bb84e270b592eacb13ed5fc',1,'cv::dnn_objdetect::InferBbox']]], - ['detectmarkers_349',['detectMarkers',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gab9159aa69250d8d3642593e508cb6baa',1,'cv::aruco::detectMarkers()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gab9159aa69250d8d3642593e508cb6baa',1,'detectMarkers()(Global Namespace)']]], - ['detectmultiscale_350',['detectMultiScale',['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#aa4c96739e441adda5005ae58fd95a5a2',1,'cv::BaseCascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, double scaleFactor, int minNeighbors, int flags, Size minSize, Size maxSize)=0'],['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#a68623391e16daa264f089af99d8d4bbb',1,'cv::BaseCascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, std::vector< int > &numDetections, double scaleFactor, int minNeighbors, int flags, Size minSize, Size maxSize)=0'],['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#afa5ead715ec7c9cf0ef71f210ba7715f',1,'cv::BaseCascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, std::vector< int > &rejectLevels, std::vector< double > &levelWeights, double scaleFactor, int minNeighbors, int flags, Size minSize, Size maxSize, bool outputRejectLevels)=0'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#aaf8181cb63968136476ec4204ffca498',1,'cv::CascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, double scaleFactor=1.1, int minNeighbors=3, int flags=0, Size minSize=Size(), Size maxSize=Size())'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a90fe1b7778bed4a27aa8482e1eecc116',1,'cv::CascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, std::vector< int > &numDetections, double scaleFactor=1.1, int minNeighbors=3, int flags=0, Size minSize=Size(), Size maxSize=Size())'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#accf96d130d9f3cf4c58bf445b7861c19',1,'cv::CascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, std::vector< int > &rejectLevels, std::vector< double > &levelWeights, double scaleFactor=1.1, int minNeighbors=3, int flags=0, Size minSize=Size(), Size maxSize=Size(), bool outputRejectLevels=false)'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a182656b878046eb3f0e9c0f0ee327f08',1,'cv::cuda::CascadeClassifier::detectMultiScale()'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#af4a3bf27a5a04817c6d584d9108f50b7',1,'cv::cuda::HOG::detectMultiScale()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a91e56a2c317392e50fbaa2f5dc78d30b',1,'cv::HOGDescriptor::detectMultiScale(InputArray img, std::vector< Rect > &foundLocations, std::vector< double > &foundWeights, double hitThreshold=0, Size winStride=Size(), Size padding=Size(), double scale=1.05, double finalThreshold=2.0, bool useMeanshiftGrouping=false) const'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a660e5cd036fd5ddf0f5767b352acd948',1,'cv::HOGDescriptor::detectMultiScale(InputArray img, std::vector< Rect > &foundLocations, double hitThreshold=0, Size winStride=Size(), Size padding=Size(), double scale=1.05, double finalThreshold=2.0, bool useMeanshiftGrouping=false) const']]], - ['detectmultiscaleroi_351',['detectMultiScaleROI',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a40aabc4ac4dbab3a855ae9182b91ef73',1,'cv::HOGDescriptor']]], - ['detector_352',['Canny Edge Detector',['https://docs.opencv.org/4.2.0/da/d5c/tutorial_canny_detector.html',1,'']]], - ['detector_353',['Creating your own corner detector',['https://docs.opencv.org/4.2.0/d9/dbc/tutorial_generic_corner_detector.html',1,'']]], - ['detector_354',['Detector',['../classAR_1_1Detector.html',1,'AR::Detector'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1Detector.html',1,'cv::Detector'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html',1,'cv::linemod::Detector']]], - ['detector_355',['detector',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a7d8e71a4a08b41f897151b6ef190c61e',1,'cv::videostab::KeypointBasedMotionEstimator']]], - ['detector_356',['Detector',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a5f60b6ace07d2435f92b6a2353ff5b08',1,'cv::linemod::Detector::Detector()'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#af509761698a542228b047865cc88c996',1,'cv::linemod::Detector::Detector(const std::vector< Ptr< Modality > > &modalities, const std::vector< int > &T_pyramid)'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1Detector.html#a5f1f484e448dc9488dc9643bd6c289ef',1,'cv::Detector::Detector()']]], - ['detector_357',['detector',['https://docs.opencv.org/4.2.0/df/ded/group__ximgproc__fast__line__detector.html',1,'Fast line detector'],['https://docs.opencv.org/4.2.0/d4/d7d/tutorial_harris_detector.html',1,'Harris corner detector'],['https://docs.opencv.org/4.2.0/d8/dd8/tutorial_good_features_to_track.html',1,'Shi-Tomasi corner detector']]], - ['detector_20api_358',['Tutorial on Facial Landmark Detector API',['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'']]], - ['detector_20good_20features_20to_20track_359',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], - ['detectorparameters_360',['DetectorParameters',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html',1,'cv::aruco::DetectorParameters'],['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a12c71ac3314cb086054c963be50d9eeb',1,'cv::aruco::DetectorParameters::DetectorParameters()']]], - ['detectortype_361',['DetectorType',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#ae9a22560b2cc9c99b3a3de82ac4af7d3',1,'cv::AgastFeatureDetector::DetectorType'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08',1,'cv::FastFeatureDetector::DetectorType']]], - ['detectregions_362',['detectRegions',['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#a49d72a1346413106516a7fc6d95c09bb',1,'cv::MSER::detectRegions()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gac4abe0243775e0d1a871a7d85fde0198',1,'cv::text::detectRegions(InputArray image, const Ptr< ERFilter > &er_filter1, const Ptr< ERFilter > &er_filter2, std::vector< std::vector< Point > > &regions)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gacead6485d0966726892094fc4aaf9dc6',1,'cv::text::detectRegions(InputArray image, const Ptr< ERFilter > &er_filter1, const Ptr< ERFilter > &er_filter2, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const String &filename=String(), float minProbability=(float) 0.5)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gac4abe0243775e0d1a871a7d85fde0198',1,'detectRegions(InputArray image, const Ptr< ERFilter > &er_filter1, const Ptr< ERFilter > &er_filter2, std::vector< std::vector< Point > > &regions)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gacead6485d0966726892094fc4aaf9dc6',1,'detectRegions(InputArray image, const Ptr< ERFilter > &er_filter1, const Ptr< ERFilter > &er_filter2, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const String &filename=String(), float minProbability=(float) 0.5)(Global Namespace)']]], - ['detectresultroi_363',['detectResultRoi',['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1detail_1_1CylindricalPortraitWarper.html#a7bd422c0430eafe4949be6933e24c7de',1,'cv::detail::CylindricalPortraitWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d3/dd6/classcv_1_1detail_1_1CylindricalWarper.html#aaccd0166c4d8ee1329288aa90bacc2c6',1,'cv::detail::CylindricalWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d9/d77/classcv_1_1detail_1_1PlanePortraitWarper.html#a5da8cdd9f86f09630634953de834852f',1,'cv::detail::PlanePortraitWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d3/d3d/classcv_1_1detail_1_1PlaneWarper.html#a838a61c562086c39c02042892765dd40',1,'cv::detail::PlaneWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'cv::detail::RotationWarperBase::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< CompressedRectilinearPortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< CompressedRectilinearProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< CylindricalPortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< CylindricalProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< FisheyeProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< MercatorProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< PaniniPortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< PaniniProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< PlanePortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< PlaneProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< SphericalPortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< SphericalProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< StereographicProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< TransverseMercatorProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d8/d70/classcv_1_1detail_1_1SphericalPortraitWarper.html#ab80c05230879653492a6da365b727658',1,'cv::detail::SphericalPortraitWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/dd0/classcv_1_1detail_1_1SphericalWarper.html#ab56a9a30d19d301f6c5cb097144699ef',1,'cv::detail::SphericalWarper::detectResultRoi()']]], - ['detectresultroibyborder_364',['detectResultRoiByBorder',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'cv::detail::RotationWarperBase::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< CompressedRectilinearPortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< CompressedRectilinearProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< CylindricalPortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< CylindricalProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< FisheyeProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< MercatorProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< PaniniPortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< PaniniProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< PlanePortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< PlaneProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< SphericalPortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< SphericalProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< StereographicProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< TransverseMercatorProjector >::detectResultRoiByBorder()']]], - ['detectroi_365',['detectROI',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a83ba7e8bd6e4b3bc6aa1aafc68659460',1,'cv::face::FacemarkLBF::Params::detectROI'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a26a3085d2f461f22b98c7b6066f51d3e',1,'cv::HOGDescriptor::detectROI()']]], - ['determinant_366',['determinant',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'Eigen::CholmodBase::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a71654e5c60a26407ecccfaa5b34bb0aa',1,'Eigen::FullPivLU::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ad8f77004bb956b603bb43fd2e3c061',1,'Eigen::MatrixBase::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ad8f77004bb956b603bb43fd2e3c061',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ad8f77004bb956b603bb43fd2e3c061',1,'MatrixBase< Solve< Decomposition, RhsType > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a54c3d39c9b46ff485a8d2140b9b23193',1,'Eigen::PartialPivLU::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'Eigen::PermutationBase::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'PermutationBase< PermutationWrapper< _IndicesType > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a29e14dd450da71659b599ce53c6c0bd1',1,'Eigen::SimplicialLDLT::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a05a34e5f9da53de1205780bd991b310d',1,'Eigen::SimplicialLLT::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a9648e81c2d0264abb5996f75b7e0b569',1,'Eigen::SparseLU::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ab8cd6bfc705c0c05a6755ae7437376f9',1,'Eigen::TriangularView::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ab8cd6bfc705c0c05a6755ae7437376f9',1,'TriangularView< const Derived, Mode >::determinant()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga06b8ec936c3cbc9502d76c7818053b41',1,'cv::determinant(const Matx< _Tp, m, m > &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf802bd9ca3e07b8b6170645ef0611d0c',1,'cv::determinant(InputArray mtx)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga06b8ec936c3cbc9502d76c7818053b41',1,'determinant(const Matx< _Tp, m, m > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf802bd9ca3e07b8b6170645ef0611d0c',1,'determinant(InputArray mtx)(Global Namespace)']]], - ['dev_5fid_367',['dev_id',['https://docs.opencv.org/4.2.0/de/d39/structcv_1_1gapi_1_1plaidml_1_1config.html#abbdf5cd394a6a6a761e25e6512eda752',1,'cv::gapi::plaidml::config']]], - ['dev_5fwith_5focv_5fon_5fandroid_2emarkdown_368',['dev_with_OCV_on_Android.markdown',['https://docs.opencv.org/4.2.0/d9/d37/dev__with__OCV__on__Android_8markdown.html',1,'']]], - ['development_369',['Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'Introduction into Android Development'],['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'Introduction to Java Development']]], - ['development_20with_20clojure_370',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], - ['development_20with_20opencv_371',['Android Development with OpenCV',['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'']]], - ['device_372',['Device',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html',1,'cv::ocl']]], - ['device_373',['device',['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#adf7dfe6389a254b59e90520ab3c7c4fc',1,'cv::ocl::Context']]], - ['device_374',['Device',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ae14a69abe6d37c41a3a9d32e7e77fded',1,'cv::ocl::Device::Device()'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2aeda46f7bf9502aa3863eee5fc664ea',1,'cv::ocl::Device::Device(void *d)'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0a0cec7084b4e2b942f34709123b734b',1,'cv::ocl::Device::Device(const Device &d)']]], - ['device_375',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], - ['device_20layer_376',['Device layer',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html',1,'']]], - ['device_5fcopy_5fobsolete_377',['DEVICE_COPY_OBSOLETE',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12a6d7b602a6172c5f2ef277515338aba79',1,'cv::UMatData']]], - ['device_5fid_378',['device_id',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#a6cedf45e3d8bde8ed5bde5b79ff08987',1,'cv::gapi::ie::detail::ParamDesc']]], - ['device_5fmem_5fmapped_379',['DEVICE_MEM_MAPPED',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12a1492fb3c927472e59cc64ba1383cd8bc',1,'cv::UMatData']]], - ['devicecopyobsolete_380',['deviceCopyObsolete',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a637d69a885ec00d4d69559efb748fa6b',1,'cv::UMatData']]], - ['devicegroup_5ft_381',['devicegroup_t',['../namespacecan.html#a1b499367fdbe137b795e3bde15a57e86',1,'can']]], - ['deviceid_382',['deviceID',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ad58f770aa964e967e8dfc5b97913e067',1,'cv::cuda::DeviceInfo']]], - ['deviceid_5ft_383',['deviceid_t',['../namespacecan.html#ae87a3af67a7f6b9a37bdb4c3e6089b10',1,'can']]], - ['deviceinfo_384',['DeviceInfo',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html',1,'cv::cuda::DeviceInfo'],['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a6ca8e4843a1724e7c525cdcd3cd2f936',1,'cv::cuda::DeviceInfo::DeviceInfo()'],['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a41fe9bf431cd452520183c79620e1d94',1,'cv::cuda::DeviceInfo::DeviceInfo(int device_id)']]], - ['devicememmapped_385',['deviceMemMapped',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#acf725c681271182c34317ac7686b415e',1,'cv::UMatData']]], - ['devicenumber_386',['deviceNumber',['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#a5d10dd0ac83091325dd807ccf18983ff',1,'cv::ocl::PlatformInfo']]], - ['deviceserial_5ft_387',['deviceserial_t',['../namespacecan.html#ad9e11e8dde365a609487743b3ebf7cd0',1,'can']]], - ['devicesupports_388',['deviceSupports',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga170b10cc9af4aa8cce8c0afdb4b1d08c',1,'cv::cuda::deviceSupports()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga170b10cc9af4aa8cce8c0afdb4b1d08c',1,'deviceSupports()(Global Namespace)']]], - ['deviceversionmajor_389',['deviceVersionMajor',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2c3c441c506d3017373a96a6883a8cd1',1,'cv::ocl::Device']]], - ['deviceversionminor_390',['deviceVersionMinor',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#af81d10a813a6cc4951b0626ad238ad23',1,'cv::ocl::Device']]], - ['dextractor_391',['dextractor',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#acd0f100ac2f377432931062ce02f16cb',1,'cv::BOWImgDescriptorExtractor']]], - ['dft_392',['DFT',['https://docs.opencv.org/4.2.0/dc/de5/classcv_1_1cuda_1_1DFT.html',1,'cv::cuda']]], - ['dft_393',['dft',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadd6cf9baf2b8b704a11b5f04aaf4f39d',1,'cv::dft()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#gadea99cb15a715c983bcc2870d65a2e78',1,'cv::cuda::dft()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadd6cf9baf2b8b704a11b5f04aaf4f39d',1,'dft(InputArray src, OutputArray dst, int flags=0, int nonzeroRows=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#gadea99cb15a715c983bcc2870d65a2e78',1,'dft(InputArray src, OutputArray dst, Size dft_size, int flags=0, Stream &stream=Stream::Null())(Global Namespace)']]], - ['dft1d_394',['DFT1D',['https://docs.opencv.org/4.2.0/d8/d03/structcv_1_1hal_1_1DFT1D.html',1,'cv::hal']]], - ['dft2d_395',['DFT2D',['https://docs.opencv.org/4.2.0/d6/d77/structcv_1_1hal_1_1DFT2D.html',1,'cv::hal']]], - ['dft_5fcomplex_5finput_396',['DFT_COMPLEX_INPUT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1caa5ccb5f191a65e2d11a5ceba1f886efd',1,'cv::DFT_COMPLEX_INPUT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1caa5ccb5f191a65e2d11a5ceba1f886efd',1,'DFT_COMPLEX_INPUT(Global Namespace)']]], - ['dft_5fcomplex_5foutput_397',['DFT_COMPLEX_OUTPUT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca07b45079b38d60e7837dfb666a55299b',1,'cv::DFT_COMPLEX_OUTPUT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca07b45079b38d60e7837dfb666a55299b',1,'DFT_COMPLEX_OUTPUT(Global Namespace)']]], - ['dft_5finverse_398',['DFT_INVERSE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca4e01d7e91cae1dbb68a26767d7b636be',1,'cv::DFT_INVERSE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca4e01d7e91cae1dbb68a26767d7b636be',1,'DFT_INVERSE(Global Namespace)']]], - ['dft_5freal_5foutput_399',['DFT_REAL_OUTPUT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca28347c7846e5eaed83e019cd003e8e03',1,'cv::DFT_REAL_OUTPUT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca28347c7846e5eaed83e019cd003e8e03',1,'DFT_REAL_OUTPUT(Global Namespace)']]], - ['dft_5frows_400',['DFT_ROWS',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca1744dc1cf1249944bc841e78c1565b7f',1,'cv::DFT_ROWS'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca1744dc1cf1249944bc841e78c1565b7f',1,'DFT_ROWS(Global Namespace)']]], - ['dft_5fscale_401',['DFT_SCALE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca74746fb171aa4bfc08ace28d73f52375',1,'cv::DFT_SCALE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca74746fb171aa4bfc08ace28d73f52375',1,'DFT_SCALE(Global Namespace)']]], - ['dftflags_402',['DftFlags',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf4dde112b483b38175621befedda1f1c',1,'cv::DftFlags'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf4dde112b483b38175621befedda1f1c',1,'DftFlags(Global Namespace)']]], - ['diag_403',['diag',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a024cc0510a4c61c7f266d4ab9fe13d7a',1,'cv::Mat::diag(int d=0) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a0f81856dbcb93eae6113947edb3ea068',1,'cv::Mat::diag(const Mat &d)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aee2330167702fd15a0b1c038b63a6198',1,'cv::Mat_::diag()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aee2330167702fd15a0b1c038b63a6198',1,'Mat_< double >::diag()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aee2330167702fd15a0b1c038b63a6198',1,'Mat_< float >::diag()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aee2330167702fd15a0b1c038b63a6198',1,'Mat_< uchar >::diag()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aee2330167702fd15a0b1c038b63a6198',1,'Mat_< unsigned char >::diag()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a1ca4c30675b372904812b6ca389b0fc0',1,'cv::MatExpr::diag()'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a45f7b6420807bae20997866f8a6ab31d',1,'cv::MatOp::diag()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'cv::Matx::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'cv::Matx::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< _Tp, cn, 1 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< _Tp, cn, 1 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, 1, 3 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, 1, 3 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, 2, 2 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, 2, 2 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, 2, 3 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, 2, 3 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, 3, 3 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, 3, 3 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, 3, 4 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, 3, 4 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, 4, 4 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, 4, 4 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, cn, 1 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, cn, 1 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< float, 2, 3 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< float, 2, 3 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< float, 3, 3 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< float, 3, 3 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< float, cn, 1 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< float, cn, 1 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< float_type, 4, 4 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< float_type, 4, 4 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a4bac5184c68677463a435e2bee4a8ac7',1,'cv::UMat::diag(int d=0) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a0da02ad901084904580cf4b39d1552e9',1,'cv::UMat::diag(const UMat &d)']]], - ['diag_5ftype_404',['diag_type',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'cv::Matx::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< _Tp, cn, 1 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, 1, 3 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, 2, 2 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, 2, 3 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, 3, 3 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, 3, 4 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, 4, 4 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, cn, 1 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< float, 2, 3 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< float, 3, 3 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< float, cn, 1 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< float_type, 4, 4 >::diag_type']]], - ['diagnostics_405',['Diagnostics',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01473.html',1,'']]], - ['diagonal_406',['Diagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1Diagonal.html',1,'Eigen']]], - ['diagonal_407',['diagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a92fbafe85f1c941ed0b4c92711e8db56',1,'Eigen::AlignedBox::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a49c751bd59187979e1406b18e3b16049',1,'Eigen::DiagonalMatrix::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a71b770614009e5af4b63d5f8005af2a5',1,'Eigen::DiagonalMatrix::diagonal() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalWrapper.html#afd4146738d335e1ce99cffde198f1f31',1,'Eigen::DiagonalWrapper::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a63882a46e6f35b432d427f280f7a18e5',1,'Eigen::MatrixBase::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a13d4b8efbd7797ee8efd3dd988a7f7',1,'Eigen::MatrixBase::diagonal(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aed11a711c0a3d5dbf8bc094008e29846',1,'Eigen::MatrixBase::diagonal(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a63882a46e6f35b432d427f280f7a18e5',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a13d4b8efbd7797ee8efd3dd988a7f7',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::diagonal(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aed11a711c0a3d5dbf8bc094008e29846',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::diagonal(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a63882a46e6f35b432d427f280f7a18e5',1,'MatrixBase< Solve< Decomposition, RhsType > >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a13d4b8efbd7797ee8efd3dd988a7f7',1,'MatrixBase< Solve< Decomposition, RhsType > >::diagonal(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aed11a711c0a3d5dbf8bc094008e29846',1,'MatrixBase< Solve< Decomposition, RhsType > >::diagonal(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a9fcc7108054ac4a3b0ef758c794c16a7',1,'Eigen::SelfAdjointView::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a9fcc7108054ac4a3b0ef758c794c16a7',1,'SelfAdjointView< const Derived, UpLo >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af83005640c2771ebd69f98848720ee52',1,'Eigen::SparseMatrix::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4423486f9fd64cbac7be06c748b37e0a',1,'Eigen::SparseMatrix::diagonal() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af83005640c2771ebd69f98848720ee52',1,'SparseMatrix< Scalar >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4423486f9fd64cbac7be06c748b37e0a',1,'SparseMatrix< Scalar >::diagonal() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af83005640c2771ebd69f98848720ee52',1,'SparseMatrix< Scalar, ColMajor, int >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4423486f9fd64cbac7be06c748b37e0a',1,'SparseMatrix< Scalar, ColMajor, int >::diagonal() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af83005640c2771ebd69f98848720ee52',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4423486f9fd64cbac7be06c748b37e0a',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::diagonal() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af83005640c2771ebd69f98848720ee52',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4423486f9fd64cbac7be06c748b37e0a',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::diagonal() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a0b7ff4860aa6f7c0761b1059c012fd8e',1,'Eigen::Tridiagonalization::diagonal()']]], - ['diagonal_3c_20const_20derived_2c_20index_20_3e_408',['Diagonal< const Derived, Index >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Diagonal.html',1,'']]], - ['diagonalmatrix_409',['DiagonalMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html',1,'Eigen::DiagonalMatrix< class, SizeAtCompileTime, MaxSizeAtCompileTime >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a07deda6348ef81a6a07577c40e5a8687',1,'Eigen::DiagonalMatrix::DiagonalMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a41b3d77b1ce65062a9ab53073083bac8',1,'Eigen::DiagonalMatrix::DiagonalMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a09701a17fa9ead2145174b4f4db6ab67',1,'Eigen::DiagonalMatrix::DiagonalMatrix(const MatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a7733cedccd7422367a5face3a80cf825',1,'Eigen::DiagonalMatrix::DiagonalMatrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a8d674e5eaa4c378d5a3f96a9007ca349',1,'Eigen::DiagonalMatrix::DiagonalMatrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a09d6cb930dff5e147ce22e08f2bb74b5',1,'Eigen::DiagonalMatrix::DiagonalMatrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#ac02390a9988bc1e7e54e133ba68bacee',1,'Eigen::DiagonalMatrix::DiagonalMatrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#ab069e106761d66fe1c2c494e7daf2244',1,'Eigen::DiagonalMatrix::DiagonalMatrix(Index dim)']]], - ['diagonalpreconditioner_410',['DiagonalPreconditioner',['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalPreconditioner.html',1,'Eigen']]], - ['diagonalsize_411',['diagonalSize',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab79e511b9322b8b801858e253fb257eb',1,'Eigen::MatrixBase::diagonalSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab79e511b9322b8b801858e253fb257eb',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::diagonalSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab79e511b9322b8b801858e253fb257eb',1,'MatrixBase< Solve< Decomposition, RhsType > >::diagonalSize()']]], - ['diagonalwrapper_412',['DiagonalWrapper',['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalWrapper.html',1,'Eigen::DiagonalWrapper< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalWrapper.html#af71ac89792969bdd7f2661fa6d4159a0',1,'Eigen::DiagonalWrapper::DiagonalWrapper()']]], - ['diamond_20markers_413',['Detection of Diamond Markers',['https://docs.opencv.org/4.2.0/d5/d07/tutorial_charuco_diamond_detection.html',1,'']]], - ['dict_414',['Dict',['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html',1,'cv::dnn']]], - ['dict_2ehpp_415',['dict.hpp',['https://docs.opencv.org/4.2.0/df/de6/dict_8hpp.html',1,'']]], - ['dict_5f4x4_5f100_416',['DICT_4X4_100',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6df6c3ad38ac44ea1546ef4f4841f310',1,'cv::aruco::DICT_4X4_100'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6df6c3ad38ac44ea1546ef4f4841f310',1,'DICT_4X4_100(Global Namespace)']]], - ['dict_5f4x4_5f1000_417',['DICT_4X4_1000',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a395a8309569c1977538fd11b57752087',1,'cv::aruco::DICT_4X4_1000'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a395a8309569c1977538fd11b57752087',1,'DICT_4X4_1000(Global Namespace)']]], - ['dict_5f4x4_5f250_418',['DICT_4X4_250',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ab76bdd5591c56a72b4359f7e34b0d681',1,'cv::aruco::DICT_4X4_250'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ab76bdd5591c56a72b4359f7e34b0d681',1,'DICT_4X4_250(Global Namespace)']]], - ['dict_5f4x4_5f50_419',['DICT_4X4_50',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ada8e830ff0024e839e93c01f5fed0c55',1,'cv::aruco::DICT_4X4_50'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ada8e830ff0024e839e93c01f5fed0c55',1,'DICT_4X4_50(Global Namespace)']]], - ['dict_5f5x5_5f100_420',['DICT_5X5_100',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a85cd9c2830621caeeda490d059bc2743',1,'cv::aruco::DICT_5X5_100'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a85cd9c2830621caeeda490d059bc2743',1,'DICT_5X5_100(Global Namespace)']]], - ['dict_5f5x5_5f1000_421',['DICT_5X5_1000',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a74a4638c42518ef99248639169b4f96b',1,'cv::aruco::DICT_5X5_1000'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a74a4638c42518ef99248639169b4f96b',1,'DICT_5X5_1000(Global Namespace)']]], - ['dict_5f5x5_5f250_422',['DICT_5X5_250',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975aeef63448bb93975855db174da8d4e008',1,'cv::aruco::DICT_5X5_250'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975aeef63448bb93975855db174da8d4e008',1,'DICT_5X5_250(Global Namespace)']]], - ['dict_5f5x5_5f50_423',['DICT_5X5_50',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a37f2f428fbac13d12e90c47e8c6fc8d1',1,'cv::aruco::DICT_5X5_50'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a37f2f428fbac13d12e90c47e8c6fc8d1',1,'DICT_5X5_50(Global Namespace)']]], - ['dict_5f6x6_5f100_424',['DICT_6X6_100',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a033f9561c7bd604f70912ecb9a49fee2',1,'cv::aruco::DICT_6X6_100'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a033f9561c7bd604f70912ecb9a49fee2',1,'DICT_6X6_100(Global Namespace)']]], - ['dict_5f6x6_5f1000_425',['DICT_6X6_1000',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a9f3ab829fb35fc9ff30e8f809d318e03',1,'cv::aruco::DICT_6X6_1000'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a9f3ab829fb35fc9ff30e8f809d318e03',1,'DICT_6X6_1000(Global Namespace)']]], - ['dict_5f6x6_5f250_426',['DICT_6X6_250',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6eb1a3e9c94c7123d8b1904a57193f16',1,'cv::aruco::DICT_6X6_250'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6eb1a3e9c94c7123d8b1904a57193f16',1,'DICT_6X6_250(Global Namespace)']]], - ['dict_5f6x6_5f50_427',['DICT_6X6_50',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ad5b25a02c860debd3cba97975b90cc1e',1,'cv::aruco::DICT_6X6_50'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ad5b25a02c860debd3cba97975b90cc1e',1,'DICT_6X6_50(Global Namespace)']]], - ['dict_5f7x7_5f100_428',['DICT_7X7_100',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a5a3270f81a64936b79e8e9712187b85d',1,'cv::aruco::DICT_7X7_100'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a5a3270f81a64936b79e8e9712187b85d',1,'DICT_7X7_100(Global Namespace)']]], - ['dict_5f7x7_5f1000_429',['DICT_7X7_1000',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a91dc783a8d4adc55a8ff8b48212a1c27',1,'cv::aruco::DICT_7X7_1000'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a91dc783a8d4adc55a8ff8b48212a1c27',1,'DICT_7X7_1000(Global Namespace)']]], - ['dict_5f7x7_5f250_430',['DICT_7X7_250',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a69192aa267e8624d8a886d8a875fcfa6',1,'cv::aruco::DICT_7X7_250'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a69192aa267e8624d8a886d8a875fcfa6',1,'DICT_7X7_250(Global Namespace)']]], - ['dict_5f7x7_5f50_431',['DICT_7X7_50',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a7c9044100bd1cc60d41473c4cd9cb683',1,'cv::aruco::DICT_7X7_50'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a7c9044100bd1cc60d41473c4cd9cb683',1,'DICT_7X7_50(Global Namespace)']]], - ['dict_5fapriltag_5f16h5_432',['DICT_APRILTAG_16h5',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6235dfb8007de53d3e8de11bee1e3854',1,'cv::aruco::DICT_APRILTAG_16h5'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6235dfb8007de53d3e8de11bee1e3854',1,'DICT_APRILTAG_16h5(Global Namespace)']]], - ['dict_5fapriltag_5f25h9_433',['DICT_APRILTAG_25h9',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a52c8d2fe982b65dda93dd70e3d18be30',1,'cv::aruco::DICT_APRILTAG_25h9'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a52c8d2fe982b65dda93dd70e3d18be30',1,'DICT_APRILTAG_25h9(Global Namespace)']]], - ['dict_5fapriltag_5f36h10_434',['DICT_APRILTAG_36h10',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ad2f28bef0b2b725e592bce9cd34183e9',1,'cv::aruco::DICT_APRILTAG_36h10'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ad2f28bef0b2b725e592bce9cd34183e9',1,'DICT_APRILTAG_36h10(Global Namespace)']]], - ['dict_5fapriltag_5f36h11_435',['DICT_APRILTAG_36h11',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a8e9e65926cdf4898a760b3dfd9daf989',1,'cv::aruco::DICT_APRILTAG_36h11'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a8e9e65926cdf4898a760b3dfd9daf989',1,'DICT_APRILTAG_36h11(Global Namespace)']]], - ['dict_5faruco_5foriginal_436',['DICT_ARUCO_ORIGINAL',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6c2a6d747864ef4daad8cdeffa07f7c0',1,'cv::aruco::DICT_ARUCO_ORIGINAL'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6c2a6d747864ef4daad8cdeffa07f7c0',1,'DICT_ARUCO_ORIGINAL(Global Namespace)']]], - ['dictionary_437',['Dictionary',['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html',1,'cv::aruco']]], - ['dictionary_438',['dictionary',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1aruco_1_1Board.html#a733dd520d8e00312200aadab83c66672',1,'cv::aruco::Board']]], - ['dictionary_439',['Dictionary',['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a3954d49cd3dd1c9caf76b7951a1613fa',1,'cv::aruco::Dictionary::Dictionary(const Mat &_bytesList=Mat(), int _markerSize=0, int _maxcorr=0)'],['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#af17873363bfce8647d6b061c4e3d2245',1,'cv::aruco::Dictionary::Dictionary(const Ptr< Dictionary > &_dictionary)']]], - ['dictionary_2ehpp_440',['dictionary.hpp',['https://docs.opencv.org/4.2.0/dc/df7/dictionary_8hpp.html',1,'']]], - ['dictvalue_441',['DictValue',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html',1,'cv::dnn::DictValue'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a698b06bee20e36ba4958958671dd63f2',1,'cv::dnn::DictValue::DictValue(const DictValue &r)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a4f6f8525de9b300853993e40412191b8',1,'cv::dnn::DictValue::DictValue(bool i)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a6fee3f7959b90147181f839c6730ef83',1,'cv::dnn::DictValue::DictValue(int64 i=0)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a1cf0e958da115e684b22bb556a31ac12',1,'cv::dnn::DictValue::DictValue(int i)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#ad9ea1880c9305e3c86fbb2b9c230b212',1,'cv::dnn::DictValue::DictValue(unsigned p)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a201c45dcb3b2953a5771c9198e9a5a50',1,'cv::dnn::DictValue::DictValue(double p)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#add3c5d6732209156e725baabb5cf41c8',1,'cv::dnn::DictValue::DictValue(const String &s)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a6a65b943e5dc77120103b6b4efdd065a',1,'cv::dnn::DictValue::DictValue(const char *s)']]], - ['diff_442',['diff',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a1c1f21327df91a4dd6c5f5a107240385.html#a1c1f21327df91a4dd6c5f5a107240385',1,'nlohmann::basic_json::diff()'],['../classrobot_1_1types_1_1LimitSwitchData.html#a00f300a3253cff50c47a4054d485fcab',1,'robot::types::LimitSwitchData::diff()']]], - ['diff_5fcharbonnier_443',['DIFF_CHARBONNIER',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a95fa590c085aad08adca9e2d962bad3da94ad3fbf098e9b7f9fb6a5a754067967',1,'cv::KAZE']]], - ['diff_5fpm_5fg1_444',['DIFF_PM_G1',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a95fa590c085aad08adca9e2d962bad3dad6659572d4c1e28eac8f2457c659dd8c',1,'cv::KAZE']]], - ['diff_5fpm_5fg2_445',['DIFF_PM_G2',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a95fa590c085aad08adca9e2d962bad3daf0bf57c733e7cf3d4f465523e9c058d1',1,'cv::KAZE']]], - ['diff_5fweickert_446',['DIFF_WEICKERT',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a95fa590c085aad08adca9e2d962bad3da447463a563f9ac8e641dca67e4cda08b',1,'cv::KAZE']]], - ['diffdrivekinematics_447',['DiffDriveKinematics',['../classkinematics_1_1DiffDriveKinematics.html',1,'kinematics::DiffDriveKinematics'],['../classkinematics_1_1DiffDriveKinematics.html#aa7ed30b4de6cb335e3ca2e2a66a73247',1,'kinematics::DiffDriveKinematics::DiffDriveKinematics()']]], - ['difference_448',['Element-wise absolute difference',['https://docs.opencv.org/4.2.0/d5/dec/group__core__hal__interface__absdiff.html',1,'']]], - ['difference_5fthreshold_449',['difference_threshold',['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a918778bf0ba6419ed272c8b2b7739baf',1,'cv::linemod::DepthNormal']]], - ['difference_5ftype_450',['difference_type',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a2b21e4c026b5a64f53b1eea298b89735',1,'cv::Allocator::difference_type'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ae11eaf393d7a95387aa2f5298a296fb6',1,'cv::MatConstIterator::difference_type'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#afd6e21498919734f64f2957e87485a7e',1,'cv::MatConstIterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a60ca6e16f3a71fde157c1376d14afc62',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a60ca6e16f3a71fde157c1376d14afc62',1,'__gnu_pbds::detail::bin_search_tree_node_it_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#a74b080229c28726dcc2bf12ce54cfefe',1,'__gnu_pbds::detail::binary_heap_const_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#afa0007845d620ae7f329c9813ecfe7d0',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#a7a99e74779506a128cd9557bcdb62294',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a616b40631335033152a105b5f70abd0a',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a653e076069bf6f57a6b09ca015d56a4e',1,'allocator_traits< _Tp_alloc_type >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#a5aa0e868f0386bf8136500e986ccdbdd',1,'const_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< input_iterator_tag, _CharT, _Traits::off_type, _CharT *, _CharT >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< input_iterator_tag, _Tp, _Dist, const _Tp *, const _Tp & >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< iterator_traits< _Iterator >::iterator_category, iterator_traits< _Iterator >::value_type, iterator_traits< _Iterator >::difference_type, iterator_traits< _Iterator >::pointer, iterator_traits< _Iterator >::reference >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< output_iterator_tag, void, void, void, void >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< std::output_iterator_tag, void, void, void, void >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< std::random_access_iterator_tag, _CharT >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< std::random_access_iterator_tag, bool >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a8fcb57cdcee0a5668a3aae97bc159ff6',1,'iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#af7235d3d4813ccc8f644d3f099691c3a',1,'point_const_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#add99e941f5a6608fd1944d01db299168',1,'point_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a653e076069bf6f57a6b09ca015d56a4e',1,'std::allocator_traits::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a882b662be1b1300acf04490112ae63f3',1,'std::allocator_traits< allocator< _Tp > >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::back_insert_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::front_insert_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::insert_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::istream_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::istreambuf_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::ostream_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::ostreambuf_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06311.html#aae92f86267e7a5f41c435f4f28eecbdb',1,'std::pointer_traits::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06323.html#a795f872c4242cf5a82add01ec8a295ed',1,'std::pointer_traits< _Tp * >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::raw_storage_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a1209ccfa7ee8ec775e03282e07a4d3ab',1,'std::set::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a1209ccfa7ee8ec775e03282e07a4d3ab',1,'std::set::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aede8ad7332db3b16e68cec19c0dd963e',1,'std::unordered_map::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aede8ad7332db3b16e68cec19c0dd963e',1,'std::unordered_map::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ab91e542e87512944adfb13fcff51d7c8',1,'std::unordered_multimap::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ab91e542e87512944adfb13fcff51d7c8',1,'std::unordered_multimap::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0dfc41e4c0a1ec68c0e4ee0fba4783ee',1,'std::unordered_multiset::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0dfc41e4c0a1ec68c0e4ee0fba4783ee',1,'std::unordered_multiset::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a78081fffb25f4c7c28a59c7cf4218c51',1,'std::unordered_set::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a78081fffb25f4c7c28a59c7cf4218c51',1,'std::unordered_set::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aede8ad7332db3b16e68cec19c0dd963e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aede8ad7332db3b16e68cec19c0dd963e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::difference_type'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3d20d11e5dfe95084a76f62eca54fadd.html#a3d20d11e5dfe95084a76f62eca54fadd',1,'nlohmann::basic_json::difference_type']]], - ['different_20datasets_451',['Framework for working with different datasets',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html',1,'']]], - ['different_20image_20hashing_20algorithms_452',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], - ['difficult_453',['difficult',['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#ae663f41a5cb817c5e53ce03a5927f783',1,'cv::datasets::PascalObj']]], - ['diffusivitytype_454',['DiffusivityType',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a95fa590c085aad08adca9e2d962bad3d',1,'cv::KAZE']]], - ['diffwristkinematics_455',['DiffWristKinematics',['../classkinematics_1_1DiffWristKinematics.html',1,'kinematics']]], - ['digamma_456',['digamma',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af40db84b3db19fe25fe2f77c429420e5',1,'Eigen']]], - ['digits_457',['digits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a6e3cb3ba2f8a6742d4759b989e5e3fed',1,'std::__numeric_limits_base::digits'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a6e3cb3ba2f8a6742d4759b989e5e3fed',1,'std::numeric_limits::digits']]], - ['digits10_458',['digits10',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#acc2df72b67282d8ad4ca54cbb4826475',1,'std::__numeric_limits_base::digits10'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#acc2df72b67282d8ad4ca54cbb4826475',1,'std::numeric_limits::digits10']]], - ['dilate_459',['dilate',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga4ff0f3318642c4f469d0e11f242f3b6c',1,'cv::dilate()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga2bbdb0560707a4d2b0b0e3c4bdf41975',1,'cv::gapi::dilate()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#gac3de990089892266fa30189edcb6da3c',1,'cv::ximgproc::rl::dilate()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga4ff0f3318642c4f469d0e11f242f3b6c',1,'dilate(InputArray src, OutputArray dst, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga2bbdb0560707a4d2b0b0e3c4bdf41975',1,'dilate(const GMat &src, const Mat &kernel, const Point &anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#gac3de990089892266fa30189edcb6da3c',1,'dilate(InputArray rlSrc, OutputArray rlDest, InputArray rlKernel, Point anchor=Point(0, 0))(Global Namespace)']]], - ['dilate3x3_460',['dilate3x3',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gafa1c08d3a18264ca3089ec843658108b',1,'cv::gapi::dilate3x3()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gafa1c08d3a18264ca3089ec843658108b',1,'dilate3x3(const GMat &src, int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)']]], - ['dilating_461',['Eroding and Dilating',['https://docs.opencv.org/4.2.0/db/df6/tutorial_erosion_dilatation.html',1,'']]], - ['dilation_462',['dilation',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html#a7fec6cdaed8a7ebadf4d424ff2c0797d',1,'cv::dnn::BaseConvolutionLayer']]], - ['dilations_463',['dilations',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html#a544fe2da6b63670d107c3273b7caec1c',1,'cv::dnn::BaseConvolutionLayer']]], - ['dim_464',['dim',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a5301115f222e591b38cc1ebed36856e1',1,'Eigen::AlignedBox::dim()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a23de6500e87586f5ca9904fe5315b51d',1,'Eigen::Hyperplane::dim()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a68d562318c269edaa8ecb7aca98706d4',1,'Eigen::ParametrizedLine::dim()']]], - ['dimensional_20phase_20maps_465',['Unwrap two-dimensional phase maps',['https://docs.opencv.org/4.2.0/d9/dfb/tutorial_unwrap.html',1,'']]], - ['dimensional_20spaces_466',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], - ['dimensionofkernel_467',['dimensionOfKernel',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a7c9294565d179226133770160b827be1',1,'Eigen::ColPivHouseholderQR::dimensionOfKernel()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a7c9294565d179226133770160b827be1',1,'ColPivHouseholderQR< MatrixType >::dimensionOfKernel()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#aca2b59560c4851b7d7701872990a3426',1,'Eigen::CompleteOrthogonalDecomposition::dimensionOfKernel()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a3b5fe5edc66acc01c45b16e728470aa0',1,'Eigen::FullPivHouseholderQR::dimensionOfKernel()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a64e191225834e91161ea53ad4b78167b',1,'Eigen::FullPivLU::dimensionOfKernel()']]], - ['dimode_468',['DIMode',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a88ac0672287263232bbd0f3fb1af6005',1,'cv::cudacodec::EncoderParams']]], - ['dims_469',['dims',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#aed459b7df39d58b591153e84f0139cca',1,'cv::GMatDesc::dims'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#ad474662d46f4a5cfa6fa9c561e3877b6',1,'cv::SparseMat::Hdr::dims'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a39cf614aa52567e9a945cd2609bd767b',1,'cv::Mat::dims'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a2c377f13c5449f811cc995df017afa35',1,'cv::gapi::own::detail::MatHeader::dims'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a7ad5753f30745d97f4e037516f3edf4f',1,'cv::UMat::dims'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a925e432f82689ff04dcc7d7576a735a8',1,'cv::_InputArray::dims()'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a5e7cfd2e21867c010f973db8c915bfaa',1,'cv::MatSize::dims()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a1779da985ecb9cd570e0dd71a49b6aca',1,'cv::SparseMat::dims()']]], - ['direct_5fbases_470',['direct_bases',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09819.html',1,'std::tr2']]], - ['direct_5fmask_5frange_5fhashing_471',['direct_mask_range_hashing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11151.html',1,'__gnu_pbds']]], - ['direct_5fmask_5frange_5fhashing_5fimp_2ehpp_472',['direct_mask_range_hashing_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01310.html',1,'']]], - ['direct_5fmod_5frange_5fhashing_473',['direct_mod_range_hashing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11155.html',1,'__gnu_pbds']]], - ['direct_5fmod_5frange_5fhashing_5fimp_2ehpp_474',['direct_mod_range_hashing_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01313.html',1,'']]], - ['directaccessbit_475',['DirectAccessBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gabf1e9d0516a933445a4c307ad8f14915',1,'Eigen::DirectAccessBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gabf1e9d0516a933445a4c307ad8f14915',1,'DirectAccessBit(Global Namespace)']]], - ['directaccessors_476',['DirectAccessors',['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5da50108ad00095928de06228470ceab09e',1,'Eigen::DirectAccessors'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5da50108ad00095928de06228470ceab09e',1,'DirectAccessors(Global Namespace)']]], - ['direction_5ffunc_477',['direction_func',['https://docs.opencv.org/4.2.0/d3/d97/structcv_1_1cudev_1_1direction__func.html',1,'cv::cudev']]], - ['directiontype_478',['DirectionType',['https://eigen.tuxfamily.org/dox/group__enums.html#gad49a7b3738e273eb00932271b36127f7',1,'Eigen::DirectionType'],['https://eigen.tuxfamily.org/dox/group__enums.html#gad49a7b3738e273eb00932271b36127f7',1,'DirectionType(Global Namespace)']]], - ['directives_479',['Preprocessor directives',['https://eigen.tuxfamily.org/dox/TopicPreprocessorDirectives.html',1,'']]], - ['directories_5fonly_480',['directories_only',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a1f52cf0f9500bc623b7e67d3b3eb5a61',1,'directories_only(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a1f52cf0f9500bc623b7e67d3b3eb5a61',1,'directories_only(Global Namespace)']]], - ['directwriteaccessors_481',['DirectWriteAccessors',['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5dacbe59d09ba2fdf8eac127bff1a1f0234',1,'Eigen::DirectWriteAccessors'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5dacbe59d09ba2fdf8eac127bff1a1f0234',1,'DirectWriteAccessors(Global Namespace)']]], - ['directx_20interoperability_482',['DirectX interoperability',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html',1,'']]], - ['directx_2ehpp_483',['directx.hpp',['https://docs.opencv.org/4.2.0/df/d8b/directx_8hpp.html',1,'']]], - ['disable_5ftiming_484',['DISABLE_TIMING',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa912544338415c5f8c8e55e85a139bfba4f52a0e153b5d1ae7eab089d8eb9c379',1,'cv::cuda::Event']]], - ['disablecabac_485',['DisableCabac',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a504aa47d788878810ee89524de78c4d3',1,'cv::cudacodec::EncoderParams']]], - ['disableif_486',['DisableIf',['https://docs.opencv.org/4.2.0/df/d27/structcv_1_1cudev_1_1DisableIf.html',1,'cv::cudev']]], - ['disablespspps_487',['DisableSPSPPS',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a3a5b9827c1625522ff80a5f4cddd61cc',1,'cv::cudacodec::EncoderParams']]], - ['discard_488',['discard',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a5e2f7304fcf0b11ea1cde1397fb7ddb6',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::discard()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a34ad0ea19451ee1c087351414947c190',1,'std::discard_block_engine::discard()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a80e7c314ddc6fd4cf54a5f720e89801a',1,'std::independent_bits_engine::discard()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a6c3917727c95e3e73ea25871ebd21441',1,'std::linear_congruential_engine::discard()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a5e2f7304fcf0b11ea1cde1397fb7ddb6',1,'std::mersenne_twister_engine::discard()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#ad057867e94320322ce2b19478b942244',1,'std::shuffle_order_engine::discard()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a76b226f563a8fb3eeb3c48999b3e9bc4',1,'std::subtract_with_carry_engine::discard()']]], - ['discard_5fblock_5fengine_489',['discard_block_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html',1,'std::discard_block_engine< _RandomNumberEngine, __p, __r >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#aa4197a4ae6f9057e0473bdea26087a42',1,'std::discard_block_engine::discard_block_engine()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a2fbd9faf2b21da3be4d307608020e93c',1,'std::discard_block_engine::discard_block_engine(const _RandomNumberEngine &__rng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a5b10975e19ab0b41895b72b59acb3f47',1,'std::discard_block_engine::discard_block_engine(_RandomNumberEngine &&__rng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#af23cfe2cdaf2fd6146ac3f99806d64f0',1,'std::discard_block_engine::discard_block_engine(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#ab4c425df46f55cbd80745d0ebaf8cacd',1,'std::discard_block_engine::discard_block_engine(_Sseq &__q)']]], - ['discovering_20the_20human_20retina_20and_20its_20use_20for_20image_20processing_490',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], - ['discrete_491',['DISCRETE',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a22a5db4ceb750ca68782ddb32f44562fab727f32adfac249a79ad471e3bc34fb9',1,'cv::ml::Boost']]], - ['discrete_20fourier_20transform_492',['Discrete Fourier Transform',['https://docs.opencv.org/4.2.0/d8/d01/tutorial_discrete_fourier_transform.html',1,'']]], - ['discrete_5fdistribution_493',['discrete_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html',1,'std']]], - ['discrete_5ffourier_5ftransform_2emarkdown_494',['discrete_fourier_transform.markdown',['https://docs.opencv.org/4.2.0/d7/d0e/discrete__fourier__transform_8markdown.html',1,'']]], - ['discretetocontinuous_495',['discreteToContinuous',['../namespacefilters_1_1statespace.html#a026831d15dda3bcbcc28ffeb8f3f3868',1,'filters::statespace::discreteToContinuous(const Eigen::Matrix< double, numStates, numStates > &A, double dt)'],['../namespacefilters_1_1statespace.html#aa430ea42801bc68abef9be59bf40660a',1,'filters::statespace::discreteToContinuous(Eigen::Matrix< double, numStates, numStates > &A, Eigen::Matrix< double, numStates, numInputs > &B, double dt)']]], - ['discretizea_496',['discretizeA',['../namespacefilters_1_1statespace.html#af262c3b65a5cdba914383868b5b1209e',1,'filters::statespace']]], - ['discretizeaq_497',['discretizeAQ',['../namespacefilters_1_1statespace.html#a25eab8e5d6708f3c6720ae13419b1b1c',1,'filters::statespace']]], - ['discretizeq_498',['discretizeQ',['../namespacefilters_1_1statespace.html#a23a8eb2072edcfbb6c13c88ee6bdd3f5',1,'filters::statespace']]], - ['discretizer_499',['discretizeR',['../namespacefilters_1_1statespace.html#af5e196af46e2bd76ca8ad928e583a314',1,'filters::statespace']]], - ['disjointsets_500',['DisjointSets',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html',1,'cv::detail::DisjointSets'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#ab0c7e73d1acaaa2b48a1df5066b569de',1,'cv::detail::DisjointSets::DisjointSets()']]], - ['disopticalflow_501',['DISOpticalFlow',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html',1,'cv']]], - ['disp_5fscale_502',['DISP_SCALE',['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#a5dc5659c145e9bbcf6c6209a02f6f098a5b4b128a781d8002c3bc2640912295a4',1,'cv::StereoMatcher::DISP_SCALE'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#a2ce6f411e4012e1d72f6287c55168eaba55f813e92db6e70696202c12d1f38e84',1,'cv::stereo::StereoMatcher::DISP_SCALE']]], - ['disp_5fshift_503',['DISP_SHIFT',['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#a5dc5659c145e9bbcf6c6209a02f6f098a6aadf3b0bd4503bde2531592e5f90e0b',1,'cv::StereoMatcher::DISP_SHIFT'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#a2ce6f411e4012e1d72f6287c55168eaba51b0bc809c0414dc2704e75395e3bfef',1,'cv::stereo::StereoMatcher::DISP_SHIFT']]], - ['disparity_20map_20post_20filtering_504',['Disparity map post-filtering',['https://docs.opencv.org/4.2.0/d3/d14/tutorial_ximgproc_disparity_filtering.html',1,'']]], - ['disparity_5ffilter_2ehpp_505',['disparity_filter.hpp',['https://docs.opencv.org/4.2.0/da/d08/disparity__filter_8hpp.html',1,'']]], - ['disparity_5ffiltering_2emarkdown_506',['disparity_filtering.markdown',['https://docs.opencv.org/4.2.0/d1/de3/disparity__filtering_8markdown.html',1,'']]], - ['disparitybilateralfilter_507',['DisparityBilateralFilter',['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html',1,'cv::cuda']]], - ['disparityfilter_508',['DisparityFilter',['https://docs.opencv.org/4.2.0/db/d72/classcv_1_1ximgproc_1_1DisparityFilter.html',1,'cv::ximgproc']]], - ['disparitygradient_509',['disparityGradient',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga6018bf3e2a2ed2a3335ba25ccbcddf66',1,'cv::stereo::PropagationParameters::disparityGradient'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga6018bf3e2a2ed2a3335ba25ccbcddf66',1,'disparityGradient(Global Namespace)']]], - ['disparitywlsfilter_510',['DisparityWLSFilter',['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1ximgproc_1_1DisparityWLSFilter.html',1,'cv::ximgproc']]], - ['dispartymapformation_511',['dispartyMapFormation',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a34810b40a55e57384cd45b31a25069ed',1,'cv::stereo::Matching']]], - ['display_20an_20image_512',['Load and Display an Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'']]], - ['display_5fimage_2emarkdown_513',['display_image.markdown',['https://docs.opencv.org/4.2.0/dd/d8a/display__image_8markdown.html',1,'']]], - ['displayoverlay_514',['displayOverlay',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga704e0387318cd1e7928e6fe17e81d6aa',1,'cv::displayOverlay()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga704e0387318cd1e7928e6fe17e81d6aa',1,'displayOverlay()(Global Namespace)']]], - ['displaystatusbar_515',['displayStatusBar',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gac56ae86269eb4fbd9c8d8cb7babfbf64',1,'cv::displayStatusBar()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gac56ae86269eb4fbd9c8d8cb7babfbf64',1,'displayStatusBar(const String &winname, const String &text, int delayms=0)(Global Namespace)']]], - ['dist_2eh_516',['dist.h',['https://docs.opencv.org/4.2.0/d1/d82/dist_8h.html',1,'']]], - ['dist_5fc_517',['DIST_C',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8eba507b16eb5ef95ea784ca1b3cb7b0d7ee',1,'cv::DIST_C'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8eba507b16eb5ef95ea784ca1b3cb7b0d7ee',1,'DIST_C(Global Namespace)']]], - ['dist_5ffair_518',['DIST_FAIR',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaea158f5abd2b5e2b4e79b79f55297079',1,'cv::DIST_FAIR'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaea158f5abd2b5e2b4e79b79f55297079',1,'DIST_FAIR(Global Namespace)']]], - ['dist_5fhuber_519',['DIST_HUBER',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebad701f5622a12450d3b8c85c052e7c520',1,'cv::DIST_HUBER'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebad701f5622a12450d3b8c85c052e7c520',1,'DIST_HUBER(Global Namespace)']]], - ['dist_5fl1_520',['DIST_L1',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebae5b2dfaf2ba5024d7ce47885001fad86',1,'cv::DIST_L1'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebae5b2dfaf2ba5024d7ce47885001fad86',1,'DIST_L1(Global Namespace)']]], - ['dist_5fl12_521',['DIST_L12',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8eba8f3c18d37e99f7cc58d3605f5c6f9ce9',1,'cv::DIST_L12'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8eba8f3c18d37e99f7cc58d3605f5c6f9ce9',1,'DIST_L12(Global Namespace)']]], - ['dist_5fl2_522',['DIST_L2',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaff0d1f5be0fc152a56a9b9716d158b96',1,'cv::DIST_L2'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaff0d1f5be0fc152a56a9b9716d158b96',1,'DIST_L2(Global Namespace)']]], - ['dist_5flabel_5fccomp_523',['DIST_LABEL_CCOMP',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gga3fe343d63844c40318ee627bd1c1c42fa631de3e838ee72d6a9d991b8fbce4c1d',1,'cv::DIST_LABEL_CCOMP'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gga3fe343d63844c40318ee627bd1c1c42fa631de3e838ee72d6a9d991b8fbce4c1d',1,'DIST_LABEL_CCOMP(Global Namespace)']]], - ['dist_5flabel_5fpixel_524',['DIST_LABEL_PIXEL',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gga3fe343d63844c40318ee627bd1c1c42fa5d291835de98b72caa12a9947c2cd92a',1,'cv::DIST_LABEL_PIXEL'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gga3fe343d63844c40318ee627bd1c1c42fa5d291835de98b72caa12a9947c2cd92a',1,'DIST_LABEL_PIXEL(Global Namespace)']]], - ['dist_5fmask_5f3_525',['DIST_MASK_3',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaaa68392323ccf7fad87570e41259b497a520d4f90e1e37d13d7592fd295a6b5b2',1,'cv::DIST_MASK_3'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaaa68392323ccf7fad87570e41259b497a520d4f90e1e37d13d7592fd295a6b5b2',1,'DIST_MASK_3(Global Namespace)']]], - ['dist_5fmask_5f5_526',['DIST_MASK_5',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaaa68392323ccf7fad87570e41259b497a8a8b17ed6012f6ce42e56f302c07d481',1,'cv::DIST_MASK_5'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaaa68392323ccf7fad87570e41259b497a8a8b17ed6012f6ce42e56f302c07d481',1,'DIST_MASK_5(Global Namespace)']]], - ['dist_5fmask_5fprecise_527',['DIST_MASK_PRECISE',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaaa68392323ccf7fad87570e41259b497a71e13e06c1d12eabd2acd2669f94f9ca',1,'cv::DIST_MASK_PRECISE'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaaa68392323ccf7fad87570e41259b497a71e13e06c1d12eabd2acd2669f94f9ca',1,'DIST_MASK_PRECISE(Global Namespace)']]], - ['dist_5fuser_528',['DIST_USER',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaa0bb8d897ba16dbf5a3ca96c71219a32',1,'cv::DIST_USER'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaa0bb8d897ba16dbf5a3ca96c71219a32',1,'DIST_USER(Global Namespace)']]], - ['dist_5fwelsch_529',['DIST_WELSCH',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaba5e4b3600852b7a59e78e3041be840e',1,'cv::DIST_WELSCH'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaba5e4b3600852b7a59e78e3041be840e',1,'DIST_WELSCH(Global Namespace)']]], - ['distance_530',['Distance',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#ab36887c2b93d5152ad31f74de4301589',1,'cv::tbm::ITrackerByMatching']]], - ['distance_531',['distance',['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#a1cb9bee47b20ad96e16de28f4b9cbdf1',1,'cv::DMatch::distance'],['https://docs.opencv.org/4.2.0/d2/d5a/structcv_1_1face_1_1StandardCollector_1_1PredictResult.html#af8ca2c7dfa6b9658cff62e6bfa4c241b',1,'cv::face::StandardCollector::PredictResult::distance'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a25c3e5822420b850e92023cec644c0a0',1,'Eigen::ParametrizedLine::distance()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gade7ee057985825bd6d67e7a1a682dd89',1,'__gnu_cxx::distance()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a99b049793a96260d190d781f847038bc',1,'std::distance()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gade7ee057985825bd6d67e7a1a682dd89',1,'distance(_InputIterator __first, _InputIterator __last, _Distance &__n)(Global Namespace)']]], - ['distance_20and_20matching_532',['Shape Distance and Matching',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html',1,'']]], - ['distance_20transform_20and_20watershed_20algorithm_533',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], - ['distance_5fstep_534',['distance_step',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#adc99cacce649ea3873e1fcd7899fdad3',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['distance_5fstep_5frelative_535',['distance_step_relative',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a41e7a6097f05bf724c9fccc771d228f2',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['distance_5fthreshold_536',['distance_threshold',['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#ac8e77f1630500b8921049bbce2908fca',1,'cv::linemod::DepthNormal']]], - ['distance_5ftransform_2emarkdown_537',['distance_transform.markdown',['https://docs.opencv.org/4.2.0/dc/d15/distance__transform_8markdown.html',1,'']]], - ['distancefast_538',['distanceFast',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#aac1f4b4dc7105d3d42e2dba3f084b398',1,'cv::tbm::ITrackerByMatching']]], - ['distancefunction_539',['DistanceFunction',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#afbfb1e721fa42ab53fe6cd733a51af9c',1,'cv::xfeatures2d::PCTSignatures']]], - ['distancemap_540',['distanceMap',['https://docs.opencv.org/4.2.0/d3/dea/classcv_1_1videostab_1_1FastMarchingMethod.html#af219b9d6ce2e079334a5308a8e66fb3a',1,'cv::videostab::FastMarchingMethod']]], - ['distancestrong_541',['distanceStrong',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#adb419543b0bd8129fd529ce71cbfaa92',1,'cv::tbm::ITrackerByMatching']]], - ['distancetransform_542',['distanceTransform',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga8a0b7fdfcb7a13dde018988ba3a43042',1,'cv::distanceTransform(InputArray src, OutputArray dst, OutputArray labels, int distanceType, int maskSize, int labelType=DIST_LABEL_CCOMP)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga25c259e7e2fa2ac70de4606ea800f12f',1,'cv::distanceTransform(InputArray src, OutputArray dst, int distanceType, int maskSize, int dstType=CV_32F)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga8a0b7fdfcb7a13dde018988ba3a43042',1,'distanceTransform(InputArray src, OutputArray dst, OutputArray labels, int distanceType, int maskSize, int labelType=DIST_LABEL_CCOMP)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga25c259e7e2fa2ac70de4606ea800f12f',1,'distanceTransform(InputArray src, OutputArray dst, int distanceType, int maskSize, int dstType=CV_32F)(Global Namespace)']]], - ['distancetransformlabeltypes_543',['DistanceTransformLabelTypes',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga3fe343d63844c40318ee627bd1c1c42f',1,'cv::DistanceTransformLabelTypes'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga3fe343d63844c40318ee627bd1c1c42f',1,'DistanceTransformLabelTypes(Global Namespace)']]], - ['distancetransformmasks_544',['DistanceTransformMasks',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaaa68392323ccf7fad87570e41259b497',1,'cv::DistanceTransformMasks'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaaa68392323ccf7fad87570e41259b497',1,'DistanceTransformMasks(Global Namespace)']]], - ['distancetype_545',['DistanceType',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1flann_1_1GenericIndex.html#a4b7623b6f2ebc7c1dc406460cd0cee02',1,'cv::flann::GenericIndex']]], - ['distancetypes_546',['DistanceTypes',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaa2bfbebbc5c320526897996aafa1d8eb',1,'cv::DistanceTypes'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaa2bfbebbc5c320526897996aafa1d8eb',1,'DistanceTypes(Global Namespace)']]], - ['distortion_5fmodel_547',['distortion_model',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a8f3fefa30cf9b26faf59da385028705a',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['distortpoints_548',['distortPoints',['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga75d8877a98e38d0b29b6892c5f8d7765',1,'cv::fisheye::distortPoints()'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga75d8877a98e38d0b29b6892c5f8d7765',1,'distortPoints(InputArray undistorted, OutputArray distorted, InputArray K, InputArray D, double alpha=0)(Global Namespace)']]], - ['distributions_549',['Distributions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html',1,'Bernoulli Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html',1,'Normal Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html',1,'Poisson Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01542.html',1,'Random Number Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html',1,'Uniform Distributions']]], - ['distthresh_550',['distThresh',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#a3eafeaddfc58cf879b1e64fe382108a9',1,'cv::videostab::MotionInpainter']]], - ['div_551',['div',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'cv::Matx::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< _Tp, cn, 1 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, 1, 3 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, 2, 2 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, 2, 3 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, 3, 3 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, 3, 4 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, 4, 4 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, cn, 1 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< float, 2, 3 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< float, 3, 3 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< float, cn, 1 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< float_type, 4, 4 >::div()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gac8d294174992b969881304c7035a5f9f',1,'cv::gapi::div()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gac8d294174992b969881304c7035a5f9f',1,'div()(Global Namespace)']]], - ['div16s_552',['div16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a187cb7282eb1b514b5795dcc8b0fcc',1,'cv::hal::div16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a187cb7282eb1b514b5795dcc8b0fcc',1,'div16s()(Global Namespace)']]], - ['div16u_553',['div16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaaffc26b52c8b8c88e741e6cc1bbaba21',1,'cv::hal::div16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaaffc26b52c8b8c88e741e6cc1bbaba21',1,'div16u()(Global Namespace)']]], - ['div32f_554',['div32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga39880dfe18797c0ddcee0992d50ac21e',1,'cv::hal::div32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga39880dfe18797c0ddcee0992d50ac21e',1,'div32f()(Global Namespace)']]], - ['div32s_555',['div32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae2511415ec8e1cb170392cfa9e8c0497',1,'cv::hal::div32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae2511415ec8e1cb170392cfa9e8c0497',1,'div32s()(Global Namespace)']]], - ['div64f_556',['div64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf3ea1e8b95e6e681e402dda0874bdaa4',1,'cv::hal::div64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf3ea1e8b95e6e681e402dda0874bdaa4',1,'div64f()(Global Namespace)']]], - ['div8s_557',['div8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga45f634c54c3ad6a9c5e9cace0b4d3e6e',1,'cv::hal::div8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga45f634c54c3ad6a9c5e9cace0b4d3e6e',1,'div8s()(Global Namespace)']]], - ['div8u_558',['div8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga48bae07fcb6715ecee852cc5c0189221',1,'cv::hal::div8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga48bae07fcb6715ecee852cc5c0189221',1,'div8u()(Global Namespace)']]], - ['divc_559',['divC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gabcbc1a4cc9301f8315b19b1aec4fd5d0',1,'cv::gapi::divC()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gabcbc1a4cc9301f8315b19b1aec4fd5d0',1,'divC()(Global Namespace)']]], - ['divide_560',['divide',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#aa8b2962155ee09a215639c59c50340f4',1,'cv::MatOp::divide(const MatExpr &expr1, const MatExpr &expr2, MatExpr &res, double scale=1) const'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a26a646bfe227f9731f502e97d728b3b7',1,'cv::MatOp::divide(double s, const MatExpr &expr, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6db555d30115642fedae0cda05604874',1,'cv::divide(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1f96b569cac4c286642b34eff098138e',1,'cv::divide(double scale, InputArray src2, OutputArray dst, int dtype=-1)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga124315aa226260841e25cc0b9ea99dc3',1,'cv::cuda::divide()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6db555d30115642fedae0cda05604874',1,'divide(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1f96b569cac4c286642b34eff098138e',1,'divide(double scale, InputArray src2, OutputArray dst, int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga124315aa226260841e25cc0b9ea99dc3',1,'divide(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d2c/group__core__hal__interface__divide.html',1,'Element-wise divide']]], - ['divides_561',['divides',['https://docs.opencv.org/4.2.0/de/d2a/structcv_1_1cudev_1_1divides.html',1,'cv::cudev::divides< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07367.html',1,'std::divides< class >']]], - ['divides_3c_20void_20_3e_562',['divides< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07391.html',1,'std']]], - ['division_5fk1_563',['division_k1',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a6aa622195d1d02a1796d3931791e70c8',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['division_5fk2_564',['division_k2',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#aad01910b47eafea00cbe58fd55e7b5e1',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['divrc_565',['divRC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gab715e84ee54c737916007ff7b8e6dcda',1,'cv::gapi::divRC()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gab715e84ee54c737916007ff7b8e6dcda',1,'divRC()(Global Namespace)']]], - ['divup_566',['divUp',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga52d39d0a7310cba0cf526bc9dbda5404',1,'cv::divUp(int a, unsigned int b)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga783150b042a28904f7df9e74788981e6',1,'cv::divUp(size_t a, unsigned int b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3ea029f9fa3603925b4162590cbf8d6',1,'cv::cudev::divUp()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga52d39d0a7310cba0cf526bc9dbda5404',1,'divUp(int a, unsigned int b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga783150b042a28904f7df9e74788981e6',1,'divUp(size_t a, unsigned int b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3ea029f9fa3603925b4162590cbf8d6',1,'divUp(int total, int grain)(Global Namespace)']]], - ['dmatch_567',['DMatch',['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html',1,'cv::DMatch'],['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#a546ddb9a87898f06e510e015a6de596e',1,'cv::DMatch::DMatch()'],['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#abcedc39e3f9c605472793d81ff5eb318',1,'cv::DMatch::DMatch(int _queryIdx, int _trainIdx, float _distance)'],['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#a43d07332011940086bae0ae4a43da06e',1,'cv::DMatch::DMatch(int _queryIdx, int _trainIdx, int _imgIdx, float _distance)']]], - ['dmatch_2ehpp_568',['dmatch.hpp',['https://docs.opencv.org/4.2.0/d7/de1/dmatch_8hpp.html',1,'']]], - ['dmatcher_569',['dmatcher',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#a43311e57fce860293560e05a7e933424',1,'cv::BOWImgDescriptorExtractor']]], - ['dnn_20module_570',['Deep Neural Networks (dnn module)',['https://docs.opencv.org/4.2.0/d2/d58/tutorial_table_of_content_dnn.html',1,'']]], - ['dnn_20used_20for_20object_20detection_571',['DNN used for object detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'']]], - ['dnn_20used_20for_20super_20resolution_572',['DNN used for super resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'']]], - ['dnn_2ehpp_573',['dnn.hpp',['https://docs.opencv.org/4.2.0/db/ddc/dnn_2dnn_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d8c/dnn_8hpp.html',1,'(Global Namespace)']]], - ['dnn_5fandroid_2emarkdown_574',['dnn_android.markdown',['https://docs.opencv.org/4.2.0/de/d6f/dnn__android_8markdown.html',1,'']]], - ['dnn_5fbackend_5fcuda_575',['DNN_BACKEND_CUDA',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625ab242310e1ca6b405ead9308f4b66971c',1,'cv::dnn::DNN_BACKEND_CUDA'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625ab242310e1ca6b405ead9308f4b66971c',1,'DNN_BACKEND_CUDA(Global Namespace)']]], - ['dnn_5fbackend_5fdefault_576',['DNN_BACKEND_DEFAULT',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a51129aae9bc5df62a3ba95f98008717e',1,'cv::dnn::DNN_BACKEND_DEFAULT'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a51129aae9bc5df62a3ba95f98008717e',1,'DNN_BACKEND_DEFAULT(Global Namespace)']]], - ['dnn_5fbackend_5fhalide_577',['DNN_BACKEND_HALIDE',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625ab066325cd703cf32062246e77dca4a76',1,'cv::dnn::DNN_BACKEND_HALIDE'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625ab066325cd703cf32062246e77dca4a76',1,'DNN_BACKEND_HALIDE(Global Namespace)']]], - ['dnn_5fbackend_5finference_5fengine_578',['DNN_BACKEND_INFERENCE_ENGINE',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a6d17a7450b1e077ac91faa10a1e85486',1,'cv::dnn::DNN_BACKEND_INFERENCE_ENGINE'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a6d17a7450b1e077ac91faa10a1e85486',1,'DNN_BACKEND_INFERENCE_ENGINE(Global Namespace)']]], - ['dnn_5fbackend_5fopencv_579',['DNN_BACKEND_OPENCV',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a88591466239dde609ae676cec698a5b1',1,'cv::dnn::DNN_BACKEND_OPENCV'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a88591466239dde609ae676cec698a5b1',1,'DNN_BACKEND_OPENCV(Global Namespace)']]], - ['dnn_5fbackend_5fvkcom_580',['DNN_BACKEND_VKCOM',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a91dbe681fc3246a2bd36b04e7b65122f',1,'cv::dnn::DNN_BACKEND_VKCOM'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a91dbe681fc3246a2bd36b04e7b65122f',1,'DNN_BACKEND_VKCOM(Global Namespace)']]], - ['dnn_5fcustom_5flayers_2emd_581',['dnn_custom_layers.md',['https://docs.opencv.org/4.2.0/d6/ddf/dnn__custom__layers_8md.html',1,'']]], - ['dnn_5fgooglenet_2emarkdown_582',['dnn_googlenet.markdown',['https://docs.opencv.org/4.2.0/dc/d31/dnn__googlenet_8markdown.html',1,'']]], - ['dnn_5fhalide_2emarkdown_583',['dnn_halide.markdown',['https://docs.opencv.org/4.2.0/d0/d59/dnn__halide_8markdown.html',1,'']]], - ['dnn_5fhalide_5fscheduling_2emarkdown_584',['dnn_halide_scheduling.markdown',['https://docs.opencv.org/4.2.0/d6/d74/dnn__halide__scheduling_8markdown.html',1,'']]], - ['dnn_5fjavascript_2emarkdown_585',['dnn_javascript.markdown',['https://docs.opencv.org/4.2.0/da/d1b/dnn__javascript_8markdown.html',1,'']]], - ['dnn_5fobjdetect_5ftutorial_2emarkdown_586',['dnn_objdetect_tutorial.markdown',['https://docs.opencv.org/4.2.0/dd/d87/dnn__objdetect__tutorial_8markdown.html',1,'']]], - ['dnn_5fsuperres_2ehpp_587',['dnn_superres.hpp',['https://docs.opencv.org/4.2.0/d3/db0/dnn__superres_8hpp.html',1,'']]], - ['dnn_5ftarget_5fcpu_588',['DNN_TARGET_CPU',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a17439f29cc1356016ed533e465b03539',1,'cv::dnn::DNN_TARGET_CPU'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a17439f29cc1356016ed533e465b03539',1,'DNN_TARGET_CPU(Global Namespace)']]], - ['dnn_5ftarget_5fcuda_589',['DNN_TARGET_CUDA',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a5d7e050b90e78a923d304c328d16e5f1',1,'cv::dnn::DNN_TARGET_CUDA'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a5d7e050b90e78a923d304c328d16e5f1',1,'DNN_TARGET_CUDA(Global Namespace)']]], - ['dnn_5ftarget_5fcuda_5ffp16_590',['DNN_TARGET_CUDA_FP16',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a36a5a729e39ff249d590ea78170b6968',1,'cv::dnn::DNN_TARGET_CUDA_FP16'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a36a5a729e39ff249d590ea78170b6968',1,'DNN_TARGET_CUDA_FP16(Global Namespace)']]], - ['dnn_5ftarget_5ffpga_591',['DNN_TARGET_FPGA',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a03cfa62d77507ae5e32f8aa4e559f331',1,'cv::dnn::DNN_TARGET_FPGA'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a03cfa62d77507ae5e32f8aa4e559f331',1,'DNN_TARGET_FPGA(Global Namespace)']]], - ['dnn_5ftarget_5fmyriad_592',['DNN_TARGET_MYRIAD',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a17d5b540a9ee3ee726f181f309a223b3',1,'cv::dnn::DNN_TARGET_MYRIAD'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a17d5b540a9ee3ee726f181f309a223b3',1,'DNN_TARGET_MYRIAD(Global Namespace)']]], - ['dnn_5ftarget_5fopencl_593',['DNN_TARGET_OPENCL',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a45f8ea53f004e52665078a88167c7c08',1,'cv::dnn::DNN_TARGET_OPENCL'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a45f8ea53f004e52665078a88167c7c08',1,'DNN_TARGET_OPENCL(Global Namespace)']]], - ['dnn_5ftarget_5fopencl_5ffp16_594',['DNN_TARGET_OPENCL_FP16',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5ab6d2643e6e5a3d0dfaca2ec69fd041b6',1,'cv::dnn::DNN_TARGET_OPENCL_FP16'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5ab6d2643e6e5a3d0dfaca2ec69fd041b6',1,'DNN_TARGET_OPENCL_FP16(Global Namespace)']]], - ['dnn_5ftarget_5fvulkan_595',['DNN_TARGET_VULKAN',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5aacc0a9bdf5a6ecfca0bd6557470d5a8e',1,'cv::dnn::DNN_TARGET_VULKAN'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5aacc0a9bdf5a6ecfca0bd6557470d5a8e',1,'DNN_TARGET_VULKAN(Global Namespace)']]], - ['dnn_5fyolo_2emarkdown_596',['dnn_yolo.markdown',['https://docs.opencv.org/4.2.0/dd/dfb/dnn__yolo_8markdown.html',1,'']]], - ['dnns_597',['YOLO DNNs',['https://docs.opencv.org/4.2.0/da/d9d/tutorial_dnn_yolo.html',1,'']]], - ['dnnsuperresimpl_598',['DnnSuperResImpl',['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1dnn__superres_1_1DnnSuperResImpl.html',1,'cv::dnn_superres::DnnSuperResImpl'],['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1dnn__superres_1_1DnnSuperResImpl.html#a5a9a8d189caa273fc210441f0858a8a3',1,'cv::dnn_superres::DnnSuperResImpl::DnnSuperResImpl()'],['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1dnn__superres_1_1DnnSuperResImpl.html#a21cf233916e32aca6719945aa929c156',1,'cv::dnn_superres::DnnSuperResImpl::DnnSuperResImpl(const std::string &algo, int scale)']]], - ['do_5fcompare_599',['do_compare',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a7392c4a1fc4373a7298d26b3994458f0',1,'std::collate::do_compare()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a7392c4a1fc4373a7298d26b3994458f0',1,'std::collate_byname::do_compare()']]], - ['do_5fcurr_5fsymbol_600',['do_curr_symbol',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a91f41433841daf2ac3426a6f3f08e63d',1,'std::moneypunct::do_curr_symbol()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a91f41433841daf2ac3426a6f3f08e63d',1,'std::moneypunct_byname::do_curr_symbol()']]], - ['do_5fdate_5forder_601',['do_date_order',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#ac3a094084d1cd2e48292635b48926c95',1,'std::time_get::do_date_order()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#ac3a094084d1cd2e48292635b48926c95',1,'std::time_get_byname::do_date_order()']]], - ['do_5fdecimal_5fpoint_602',['do_decimal_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ab8c59f589b65097279e206218ba986be',1,'std::moneypunct::do_decimal_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ab8c59f589b65097279e206218ba986be',1,'std::moneypunct_byname::do_decimal_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a760cc3ce936f6446b894cbe913948067',1,'std::numpunct::do_decimal_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a760cc3ce936f6446b894cbe913948067',1,'std::numpunct_byname::do_decimal_point()']]], - ['do_5ffalsename_603',['do_falsename',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aab0f0fa60cb43be85a93bad38bee99e4',1,'std::numpunct::do_falsename()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aab0f0fa60cb43be85a93bad38bee99e4',1,'std::numpunct_byname::do_falsename()']]], - ['do_5ffrac_5fdigits_604',['do_frac_digits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a43dc4eee49f0ad790bf920bf000888f9',1,'std::moneypunct::do_frac_digits()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a43dc4eee49f0ad790bf920bf000888f9',1,'std::moneypunct_byname::do_frac_digits()']]], - ['do_5fget_605',['do_get',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a2ed38702d328258ffd428b039602d92e',1,'std::messages::do_get()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a2ed38702d328258ffd428b039602d92e',1,'std::messages_byname::do_get()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a86e85bec7b677bbb2df712118b722ddc',1,'std::money_get::do_get(iter_type __s, iter_type __end, bool __intl, ios_base &__io, ios_base::iostate &__err, long double &__units) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a286ed4904b3dafae45d2df73168e3b40',1,'std::money_get::do_get(iter_type __s, iter_type __end, bool __intl, ios_base &__io, ios_base::iostate &__err, string_type &__digits) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#aee1742c1c979514fe11b7b1b6595e7ab',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, bool &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a03a67001904c1f1d5d4c34a958dedbbd',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a550d079dcba1f4140f26db766e3ae531',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned short &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#ac931765bfbbd5ba933fcb21d1bf22e7c',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned int &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a32976dd0309c30b4fa592e2d13f0cb5a',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a1d6a1d6af2dac3a1dde25e8ae1e72477',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, long long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a2b977609d4f92c8e1899dd4d76125c4f',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned long long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#abf3067e994fdf54ade5222e6f13cebcc',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, float &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a33556676f96535fa908ce805e35fda5b',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, double &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#adb04cb4c74797b0ef75038154d39f726',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, long double &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a30ca40af9407da445582b1a67c41db80',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, void *&) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#aee1742c1c979514fe11b7b1b6595e7ab',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, bool &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a03a67001904c1f1d5d4c34a958dedbbd',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a550d079dcba1f4140f26db766e3ae531',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned short &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#ac931765bfbbd5ba933fcb21d1bf22e7c',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned int &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a32976dd0309c30b4fa592e2d13f0cb5a',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a1d6a1d6af2dac3a1dde25e8ae1e72477',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, long long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a2b977609d4f92c8e1899dd4d76125c4f',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned long long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#abf3067e994fdf54ade5222e6f13cebcc',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, float &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a33556676f96535fa908ce805e35fda5b',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, double &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#adb04cb4c74797b0ef75038154d39f726',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, long double &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a30ca40af9407da445582b1a67c41db80',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, void *&) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#aac4032bde1366962ceb8004eb509917d',1,'std::time_get::do_get()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#aac4032bde1366962ceb8004eb509917d',1,'std::time_get_byname::do_get()']]], - ['do_5fget_5fdate_606',['do_get_date',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#acbe2321234fc8719d76b987b8eb57f31',1,'std::time_get::do_get_date()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#acbe2321234fc8719d76b987b8eb57f31',1,'std::time_get_byname::do_get_date()']]], - ['do_5fget_5fmonthname_607',['do_get_monthname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a87a19165aa361150c0810f123de4f13f',1,'std::time_get::do_get_monthname()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a87a19165aa361150c0810f123de4f13f',1,'std::time_get_byname::do_get_monthname()']]], - ['do_5fget_5ftime_608',['do_get_time',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#ad6ae8983f63115bc91c761bcb16264b2',1,'std::time_get::do_get_time()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#ad6ae8983f63115bc91c761bcb16264b2',1,'std::time_get_byname::do_get_time()']]], - ['do_5fget_5fweekday_609',['do_get_weekday',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a653300cbc2a2c8ec15fcd85acd9ef644',1,'std::time_get::do_get_weekday()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a653300cbc2a2c8ec15fcd85acd9ef644',1,'std::time_get_byname::do_get_weekday()']]], - ['do_5fget_5fyear_610',['do_get_year',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a04b1e9cd4573001efae175a8d2e4b8fa',1,'std::time_get::do_get_year()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a04b1e9cd4573001efae175a8d2e4b8fa',1,'std::time_get_byname::do_get_year()']]], - ['do_5fgrouping_611',['do_grouping',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#abedfe1ed30564977ec5d663d98a897cb',1,'std::moneypunct::do_grouping()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#abedfe1ed30564977ec5d663d98a897cb',1,'std::moneypunct_byname::do_grouping()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aa122f3820012ca748285e9e9f1559d12',1,'std::numpunct::do_grouping()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aa122f3820012ca748285e9e9f1559d12',1,'std::numpunct_byname::do_grouping()']]], - ['do_5fhash_612',['do_hash',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a0c49714f9b5bec2d7bc33a9a9b93919b',1,'std::collate::do_hash()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a0c49714f9b5bec2d7bc33a9a9b93919b',1,'std::collate_byname::do_hash()']]], - ['do_5fis_613',['do_is',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a13f6a9df12541e794f95b69dd7c12d8d',1,'__ctype_abstract_base< wchar_t >::do_is(mask __m, char_type __c) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a11e40e753bfcc987db52294dc0c99878',1,'__ctype_abstract_base< wchar_t >::do_is(const char_type *__lo, const char_type *__hi, mask *__vec) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a13f6a9df12541e794f95b69dd7c12d8d',1,'std::__ctype_abstract_base::do_is(mask __m, char_type __c) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a11e40e753bfcc987db52294dc0c99878',1,'std::__ctype_abstract_base::do_is(const char_type *__lo, const char_type *__hi, mask *__vec) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a35d540d6dbd1c06296f0bc0bddf8afe8',1,'std::ctype::do_is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a5013f2144fc72bd446537daa7d407ccd',1,'std::ctype::do_is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a5fddabd0a6f03cb5274020784a32eb72',1,'std::ctype< wchar_t >::do_is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a14be28229f0a8efde46ea9654297e556',1,'std::ctype< wchar_t >::do_is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a35d540d6dbd1c06296f0bc0bddf8afe8',1,'std::ctype_byname::do_is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a5013f2144fc72bd446537daa7d407ccd',1,'std::ctype_byname::do_is(const char_type *__lo, const char_type *__hi, mask *__vec) const']]], - ['do_5fnarrow_614',['do_narrow',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ab2c37d0e04ecf5a71d618ca97478c893',1,'__ctype_abstract_base< wchar_t >::do_narrow(char_type __c, char __dfault) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a5bd09acf78baf8b8ae9cff1938cf6668',1,'__ctype_abstract_base< wchar_t >::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault, char *__to) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ab2c37d0e04ecf5a71d618ca97478c893',1,'std::__ctype_abstract_base::do_narrow(char_type __c, char __dfault) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a5bd09acf78baf8b8ae9cff1938cf6668',1,'std::__ctype_abstract_base::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault, char *__to) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a01a3c227801621bd3ca9b3568c44c3a0',1,'std::ctype::do_narrow(char_type, char __dfault) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#abc730453d5fc2d3dca9e557ccc7b4394',1,'std::ctype::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault, char *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a136c4d09f8241b6d30657175f3361f4a',1,'std::ctype< char >::do_narrow(char_type __c, char __dfault __attribute__((__unused__))) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a41ccb4858b9456fcfc9bd5946314ef49',1,'std::ctype< char >::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault __attribute__((__unused__)), char *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a4c0c870d5d7ec8a6d942da3a03597da2',1,'std::ctype< wchar_t >::do_narrow(char_type __c, char __dfault) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#af77b64ba799c73ab7566f159d5dee756',1,'std::ctype< wchar_t >::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault, char *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a01a3c227801621bd3ca9b3568c44c3a0',1,'std::ctype_byname::do_narrow(char_type, char __dfault) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#abc730453d5fc2d3dca9e557ccc7b4394',1,'std::ctype_byname::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault, char *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a136c4d09f8241b6d30657175f3361f4a',1,'std::ctype_byname< char >::do_narrow(char_type __c, char __dfault __attribute__((__unused__))) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a41ccb4858b9456fcfc9bd5946314ef49',1,'std::ctype_byname< char >::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault __attribute__((__unused__)), char *__to) const']]], - ['do_5fneg_5fformat_615',['do_neg_format',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ab059421016ae9ce7368de1b1911c07b6',1,'std::moneypunct::do_neg_format()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ab059421016ae9ce7368de1b1911c07b6',1,'std::moneypunct_byname::do_neg_format()']]], - ['do_5fnegative_5fsign_616',['do_negative_sign',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a3bac54f35225e34bd08144beacff4e2e',1,'std::moneypunct::do_negative_sign()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a3bac54f35225e34bd08144beacff4e2e',1,'std::moneypunct_byname::do_negative_sign()']]], - ['do_5fout_617',['do_out',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#aa969d1e16dd100e737c5d777aa0cdf02',1,'__codecvt_abstract_base< _InternT, _ExternT, encoding_state >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#aa969d1e16dd100e737c5d777aa0cdf02',1,'__codecvt_abstract_base< char, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#aa969d1e16dd100e737c5d777aa0cdf02',1,'__codecvt_abstract_base< char16_t, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#aa969d1e16dd100e737c5d777aa0cdf02',1,'__codecvt_abstract_base< char32_t, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#aa969d1e16dd100e737c5d777aa0cdf02',1,'__codecvt_abstract_base< wchar_t, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05199.html#a5cdde44b6d296efa567c0cc94bca6f08',1,'codecvt< _Elem, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#aa969d1e16dd100e737c5d777aa0cdf02',1,'std::__codecvt_abstract_base::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05199.html#a5cdde44b6d296efa567c0cc94bca6f08',1,'std::codecvt::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10335.html#ae1283355554c11b6ce2d3dacc9e6cba0',1,'std::codecvt< _InternT, _ExternT, encoding_state >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05203.html#adc5c0e2cc9d18affc9bf2888d351d699',1,'std::codecvt< char, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05211.html#a16f65a78cd4179ab7115490453e3664e',1,'std::codecvt< char16_t, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05215.html#a1767804ef887e46a422d005ca31e2500',1,'std::codecvt< char32_t, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05207.html#a56bc3e4682156830a84159babb38d611',1,'std::codecvt< wchar_t, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05199.html#a5cdde44b6d296efa567c0cc94bca6f08',1,'std::codecvt_byname::do_out()']]], - ['do_5fpos_5fformat_618',['do_pos_format',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ad1f8646969be5d63e0edea945a902a60',1,'std::moneypunct::do_pos_format()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ad1f8646969be5d63e0edea945a902a60',1,'std::moneypunct_byname::do_pos_format()']]], - ['do_5fpositive_5fsign_619',['do_positive_sign',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a8d259d10ed08942f602ee96986584bba',1,'std::moneypunct::do_positive_sign()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a8d259d10ed08942f602ee96986584bba',1,'std::moneypunct_byname::do_positive_sign()']]], - ['do_5fput_620',['do_put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a04355d4b3e8b632d51659efce1362135',1,'std::money_put::do_put(iter_type __s, bool __intl, ios_base &__io, char_type __fill, long double __units) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#ab38a5a1a94a3354fa54dc4af38e72cb4',1,'std::money_put::do_put(iter_type __s, bool __intl, ios_base &__io, char_type __fill, const string_type &__digits) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a751c0d4e60210056dc7e8ea6f3bbd405',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, bool __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a7d1915d312132bf998bdf29b6969afe7',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a075dbdca32501d714e181253cb4614b1',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, unsigned long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#adb43c423d095bd32b806c4e44fd63cfb',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#aba459b0ab5eb2763880fd3897607ac74',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, unsigned long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a15bcd2e90efb4755b2f3d2b900773f8e',1,'std::num_put::do_put(iter_type, ios_base &, char_type, double) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a80c7eac50b4f62c5300c437ef7c31ac6',1,'std::num_put::do_put(iter_type, ios_base &, char_type, long double) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a2448fac36fa28f3a8af076b66ce70db1',1,'std::num_put::do_put(iter_type, ios_base &, char_type, const void *) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a751c0d4e60210056dc7e8ea6f3bbd405',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, bool __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a7d1915d312132bf998bdf29b6969afe7',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a075dbdca32501d714e181253cb4614b1',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, unsigned long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#adb43c423d095bd32b806c4e44fd63cfb',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#aba459b0ab5eb2763880fd3897607ac74',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, unsigned long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a15bcd2e90efb4755b2f3d2b900773f8e',1,'std::num_put::do_put(iter_type, ios_base &, char_type, double) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a80c7eac50b4f62c5300c437ef7c31ac6',1,'std::num_put::do_put(iter_type, ios_base &, char_type, long double) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a2448fac36fa28f3a8af076b66ce70db1',1,'std::num_put::do_put(iter_type, ios_base &, char_type, const void *) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a40f507cdd7cc0221fcb9053beda997c9',1,'std::time_put::do_put()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a40f507cdd7cc0221fcb9053beda997c9',1,'std::time_put_byname::do_put()']]], - ['do_5fscan_5fis_621',['do_scan_is',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a6d63444db4c605c256c36343394bb883',1,'__ctype_abstract_base< wchar_t >::do_scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a6d63444db4c605c256c36343394bb883',1,'std::__ctype_abstract_base::do_scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a9e5dfcb79a7718c330889862788e1279',1,'std::ctype::do_scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#acf1b6dfec89abd4d28e306b7f3cf7c23',1,'std::ctype< wchar_t >::do_scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a9e5dfcb79a7718c330889862788e1279',1,'std::ctype_byname::do_scan_is()']]], - ['do_5fscan_5fnot_622',['do_scan_not',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a40c1314bb60f9b9795ec8e628ffbcc34',1,'__ctype_abstract_base< wchar_t >::do_scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a40c1314bb60f9b9795ec8e628ffbcc34',1,'std::__ctype_abstract_base::do_scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#ad5c6efb9e8be0613aee87070a24098ef',1,'std::ctype::do_scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a4d9f6191ed300d3ab5e728e7a90047b2',1,'std::ctype< wchar_t >::do_scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#ad5c6efb9e8be0613aee87070a24098ef',1,'std::ctype_byname::do_scan_not()']]], - ['do_5fthousands_5fsep_623',['do_thousands_sep',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#abede1cc31a6d8a5dc30c382092e379f3',1,'std::moneypunct::do_thousands_sep()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#abede1cc31a6d8a5dc30c382092e379f3',1,'std::moneypunct_byname::do_thousands_sep()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aca44112e2524a51069b7bd674723b36e',1,'std::numpunct::do_thousands_sep()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aca44112e2524a51069b7bd674723b36e',1,'std::numpunct_byname::do_thousands_sep()']]], - ['do_5ftolower_624',['do_tolower',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a322123706f52d8c72b9c8bee3f612676',1,'__ctype_abstract_base< wchar_t >::do_tolower(char_type __c) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#afe5fc2040092e4f8fb6e88d253f4d3c3',1,'__ctype_abstract_base< wchar_t >::do_tolower(char_type *__lo, const char_type *__hi) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a322123706f52d8c72b9c8bee3f612676',1,'std::__ctype_abstract_base::do_tolower(char_type __c) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#afe5fc2040092e4f8fb6e88d253f4d3c3',1,'std::__ctype_abstract_base::do_tolower(char_type *__lo, const char_type *__hi) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a59a0ada1cc334c6c407e43af870d291e',1,'std::ctype::do_tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#aac256f247d2f52ca6f81f42a0bed6992',1,'std::ctype::do_tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#ac019737df7ce6bff299aa60d7d6b18b0',1,'std::ctype< char >::do_tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#afe122310bbeed79c8451587e257ca463',1,'std::ctype< char >::do_tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#ad8989f20ff67441f84cc2e286d34d594',1,'std::ctype< wchar_t >::do_tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#abaacddaf3a1d3adeed77aeaa71bc1a2e',1,'std::ctype< wchar_t >::do_tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a59a0ada1cc334c6c407e43af870d291e',1,'std::ctype_byname::do_tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#aac256f247d2f52ca6f81f42a0bed6992',1,'std::ctype_byname::do_tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#ac019737df7ce6bff299aa60d7d6b18b0',1,'std::ctype_byname< char >::do_tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#afe122310bbeed79c8451587e257ca463',1,'std::ctype_byname< char >::do_tolower(char_type *__lo, const char_type *__hi) const']]], - ['do_5ftoupper_625',['do_toupper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af90fbcc9340edf7ca0002520cccb0b8f',1,'__ctype_abstract_base< wchar_t >::do_toupper(char_type __c) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a51eeaf4fefdd3a85b0706028cec0c5e7',1,'__ctype_abstract_base< wchar_t >::do_toupper(char_type *__lo, const char_type *__hi) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af90fbcc9340edf7ca0002520cccb0b8f',1,'std::__ctype_abstract_base::do_toupper(char_type __c) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a51eeaf4fefdd3a85b0706028cec0c5e7',1,'std::__ctype_abstract_base::do_toupper(char_type *__lo, const char_type *__hi) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a292e998fb0eeeef612c4e879ead72bc9',1,'std::ctype::do_toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a2df6c745f13674152565a8dd6a88d9b3',1,'std::ctype::do_toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a0baaa8202343a9c588635910b4fa4d7d',1,'std::ctype< char >::do_toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aaa8745e5d3c653ba8252ec926519bb60',1,'std::ctype< char >::do_toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a56659902a772ea65838dd6481268e099',1,'std::ctype< wchar_t >::do_toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a446b87f9dde5a37ca18d7bfa07dfa80d',1,'std::ctype< wchar_t >::do_toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a292e998fb0eeeef612c4e879ead72bc9',1,'std::ctype_byname::do_toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a2df6c745f13674152565a8dd6a88d9b3',1,'std::ctype_byname::do_toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a0baaa8202343a9c588635910b4fa4d7d',1,'std::ctype_byname< char >::do_toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aaa8745e5d3c653ba8252ec926519bb60',1,'std::ctype_byname< char >::do_toupper(char_type *__lo, const char_type *__hi) const']]], - ['do_5ftransform_626',['do_transform',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a17895df009fcf8d929823aea3f1adbba',1,'std::collate::do_transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a17895df009fcf8d929823aea3f1adbba',1,'std::collate_byname::do_transform()']]], - ['do_5ftruename_627',['do_truename',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#ae560023d22e2e9c686f97f87b397c07d',1,'std::numpunct::do_truename()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#ae560023d22e2e9c686f97f87b397c07d',1,'std::numpunct_byname::do_truename()']]], - ['do_5fwiden_628',['do_widen',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0f4951419f48a08bd975cb49a81995a5',1,'__ctype_abstract_base< wchar_t >::do_widen(char __c) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a289ae9e9ce16c7c26a8356b4610c7dee',1,'__ctype_abstract_base< wchar_t >::do_widen(const char *__lo, const char *__hi, char_type *__to) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0f4951419f48a08bd975cb49a81995a5',1,'std::__ctype_abstract_base::do_widen(char __c) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a289ae9e9ce16c7c26a8356b4610c7dee',1,'std::__ctype_abstract_base::do_widen(const char *__lo, const char *__hi, char_type *__to) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a7d464e73ba99ec097116cb63a9f99761',1,'std::ctype::do_widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#aacb919dc096268066282f4dae1abcfc9',1,'std::ctype::do_widen(const char *__lo, const char *__hi, char_type *__dest) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a37bae5847ddd2a3e9dda66b2bb663f38',1,'std::ctype< char >::do_widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#ad1c0a38350b682ac361a85ca1ac6ddc5',1,'std::ctype< char >::do_widen(const char *__lo, const char *__hi, char_type *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a027a349455fcbe1572794e5e6ffc25b3',1,'std::ctype< wchar_t >::do_widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#ad2118710f1ca2b452af0cf54ee179c56',1,'std::ctype< wchar_t >::do_widen(const char *__lo, const char *__hi, char_type *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a7d464e73ba99ec097116cb63a9f99761',1,'std::ctype_byname::do_widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#aacb919dc096268066282f4dae1abcfc9',1,'std::ctype_byname::do_widen(const char *__lo, const char *__hi, char_type *__dest) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a37bae5847ddd2a3e9dda66b2bb663f38',1,'std::ctype_byname< char >::do_widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#ad1c0a38350b682ac361a85ca1ac6ddc5',1,'std::ctype_byname< char >::do_widen(const char *__lo, const char *__hi, char_type *__to) const']]], - ['docorrectionforinclusion_629',['doCorrectionForInclusion',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ab72fa834ec03b7db3d1c1926b8c900e6',1,'cv::videostab::StabilizerBase']]], - ['docorrectionforinclusion_5f_630',['doCorrectionForInclusion_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a14468697674d4710267abeaba1dfefbe',1,'cv::videostab::StabilizerBase']]], - ['documentation_20for_20opencv_631',['Writing documentation for OpenCV',['https://docs.opencv.org/4.2.0/d4/db1/tutorial_documentation.html',1,'']]], - ['documentation_5ftutorial_2emarkdown_632',['documentation_tutorial.markdown',['https://docs.opencv.org/4.2.0/d6/d6b/documentation__tutorial_8markdown.html',1,'']]], - ['dodeblurring_5f_633',['doDeblurring_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a39b55a0336972805eab06cab1ac0e727',1,'cv::videostab::StabilizerBase']]], - ['doinpainting_5f_634',['doInpainting_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a5705ca2493231a2b041412434b25d37b',1,'cv::videostab::StabilizerBase']]], - ['domain_5ferror_635',['domain_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02795.html',1,'std']]], - ['dontalign_636',['DontAlign',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13a56908522e51443a0aa0567f879c2e78a',1,'Eigen::DontAlign'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13a56908522e51443a0aa0567f879c2e78a',1,'DontAlign(Global Namespace)']]], - ['dooneiteration_637',['doOneIteration',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ade2bda91481dab757bf2ffe3f4f27465',1,'cv::videostab::StabilizerBase']]], - ['dot_638',['dot',['https://docs.opencv.org/4.2.0/d1/dfd/structcv_1_1optflow_1_1GPCPatchDescriptor.html#a288f37934866eb0e753303e789973c05',1,'cv::optflow::GPCPatchDescriptor::dot()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a0f683eab191eeece33dfc64ae299a9cb',1,'cv::Mat::dot()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2e20e53ae2e09a0f0575d9f3987067c1',1,'cv::MatExpr::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'cv::Matx::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< _Tp, cn, 1 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, 1, 3 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, 2, 2 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, 2, 3 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, 3, 3 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, 3, 4 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, 4, 4 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, cn, 1 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< float, 2, 3 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< float, 3, 3 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< float, cn, 1 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< float_type, 4, 4 >::dot()'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a26936af228834ab76b93d1b922fa4762',1,'cv::Point3_::dot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a4728ce98be0240d836c4896021688aa5',1,'cv::Point_::dot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a4728ce98be0240d836c4896021688aa5',1,'Point_< double >::dot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a4728ce98be0240d836c4896021688aa5',1,'Point_< float >::dot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a4728ce98be0240d836c4896021688aa5',1,'Point_< int >::dot()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a6daed34dfaccf50a34aca1d1ee5e5027',1,'cv::UMat::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adfd32bf5fcf6ee603c924dde9bf7bc39',1,'Eigen::MatrixBase::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adfd32bf5fcf6ee603c924dde9bf7bc39',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adfd32bf5fcf6ee603c924dde9bf7bc39',1,'MatrixBase< Solve< Decomposition, RhsType > >::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa2d22c5b321c9539dd625ca415422236',1,'Eigen::QuaternionBase::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa2d22c5b321c9539dd625ca415422236',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa2d22c5b321c9539dd625ca415422236',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa2d22c5b321c9539dd625ca415422236',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::dot()']]], - ['doublefpconfig_639',['doubleFPConfig',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a47b02c6821d4b193d5f20fc3d6f1a727',1,'cv::ocl::Device']]], - ['down_5fcast_640',['down_cast',['https://docs.opencv.org/4.2.0/d4/d88/namespacecv_1_1internal.html#a38a46a178fc203af27735cab909db334',1,'cv::internal']]], - ['downhillsolver_641',['DownhillSolver',['https://docs.opencv.org/4.2.0/d4/d43/classcv_1_1DownhillSolver.html',1,'cv']]], - ['download_642',['download',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a027e74e4364ddfd9687b58aa5db8d4e8',1,'cv::cuda::GpuMat::download(OutputArray dst) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a2522fd0642c30e0455ec52a28bd3be7b',1,'cv::cuda::GpuMat::download(OutputArray dst, Stream &stream) const'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#a7e71003dc04d6e3b1ec6eb884a6b541a',1,'cv::MatAllocator::download()']]], - ['downloaddescriptors_643',['downloadDescriptors',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#aa810356f1c5eb81474735ec57a5bdea4',1,'cv::cuda::SURF_CUDA']]], - ['downloadkeypoints_644',['downloadKeypoints',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a2d01e23e3092305d4a57fdeccca8c961',1,'cv::cuda::SURF_CUDA']]], - ['downloadresults_645',['downloadResults',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#acdcc2461e0f46ebda28dee9d8dcf912d',1,'cv::cuda::HoughLinesDetector']]], - ['dowobblesuppression_5f_646',['doWobbleSuppression_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#aac5c916da3621d2367acb9abb6b6dee6',1,'cv::videostab::TwoPassStabilizer']]], - ['doxygen_20projects_647',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], - ['dp_648',['DP',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a3117ebd577b9a33c143918ecacfa5c0e',1,'cv::tracking::UnscentedKalmanFilterParams']]], - ['dp_5fseam_649',['DP_SEAM',['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html#aa8c4c8cb01e15b4652116630d93c3eb2a9dd52fcf64f3609ac84cebbef9fc1c9b',1,'cv::detail::SeamFinder']]], - ['dpm_2ehpp_650',['dpm.hpp',['https://docs.opencv.org/4.2.0/da/d8a/dpm_8hpp.html',1,'']]], - ['dpmdetector_651',['DPMDetector',['https://docs.opencv.org/4.2.0/df/dba/classcv_1_1dpm_1_1DPMDetector.html',1,'cv::dpm']]], - ['dpseamfinder_652',['DpSeamFinder',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html',1,'cv::detail::DpSeamFinder'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a1ab92a71baf2444abf8129e3bddc7151',1,'cv::detail::DpSeamFinder::DpSeamFinder(CostFunction costFunc=COLOR)'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a83359299259252cd362d91b3734ffba6',1,'cv::detail::DpSeamFinder::DpSeamFinder(String costFunc)']]], - ['draw_653',['draw',['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html#a5f1b7c91bd8bf8271931d6f06292f1bc',1,'cv::aruco::CharucoBoard::draw()'],['https://docs.opencv.org/4.2.0/de/d05/classcv_1_1aruco_1_1GridBoard.html#aae344f00868cd472c430303c3cbfa998',1,'cv::aruco::GridBoard::draw()']]], - ['draw_5fover_5foutimg_654',['DRAW_OVER_OUTIMG',['https://docs.opencv.org/4.2.0/d8/d6f/structcv_1_1line__descriptor_1_1DrawLinesMatchesFlags.html#af77f9b45585f16821d7a06ea38909e68a7be06b0d6664e11916bc8337ffd0f965',1,'cv::line_descriptor::DrawLinesMatchesFlags::DRAW_OVER_OUTIMG'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a32be7350ff5af15003fcaddf36653971',1,'DRAW_OVER_OUTIMG(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a32be7350ff5af15003fcaddf36653971',1,'DRAW_OVER_OUTIMG(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a32be7350ff5af15003fcaddf36653971',1,'DRAW_OVER_OUTIMG(Global Namespace)']]], - ['draw_5frich_5fkeypoints_655',['DRAW_RICH_KEYPOINTS',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8ad640260b7dc8b32e0bf35c2696da24f8',1,'DRAW_RICH_KEYPOINTS(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8ad640260b7dc8b32e0bf35c2696da24f8',1,'DRAW_RICH_KEYPOINTS(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8ad640260b7dc8b32e0bf35c2696da24f8',1,'DRAW_RICH_KEYPOINTS(Global Namespace)']]], - ['drawactivetracks_656',['drawActiveTracks',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a30df875f7c57899a83310ae789293522',1,'cv::tbm::ITrackerByMatching']]], - ['drawaxis_657',['drawAxis',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga16fda651a4e6a8f5747a85cbb6b400a2',1,'cv::aruco::drawAxis()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga16fda651a4e6a8f5747a85cbb6b400a2',1,'drawAxis()(Global Namespace)']]], - ['drawcharucodiamond_658',['drawCharucoDiamond',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gaf71fb897d5f03f7424c0c84715aa6228',1,'cv::aruco::drawCharucoDiamond()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gaf71fb897d5f03f7424c0c84715aa6228',1,'drawCharucoDiamond()(Global Namespace)']]], - ['drawchessboardcorners_659',['drawChessboardCorners',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga6a10b0bb120c4907e5eabbcd22319022',1,'cv::drawChessboardCorners()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga6a10b0bb120c4907e5eabbcd22319022',1,'drawChessboardCorners()(Global Namespace)']]], - ['drawcolordisp_660',['drawColorDisp',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#ga469b23a77938dd7c06861e59cecc08c5',1,'cv::cuda::drawColorDisp()'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#ga469b23a77938dd7c06861e59cecc08c5',1,'drawColorDisp()(Global Namespace)']]], - ['drawcontours_661',['drawContours',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga746c0625f1781f1ffc9056259103edbc',1,'cv::drawContours()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga746c0625f1781f1ffc9056259103edbc',1,'drawContours()(Global Namespace)']]], - ['drawdetectedcornerscharuco_662',['drawDetectedCornersCharuco',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga7225eee644190f791e1583c499b7ab10',1,'cv::aruco::drawDetectedCornersCharuco()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga7225eee644190f791e1583c499b7ab10',1,'drawDetectedCornersCharuco()(Global Namespace)']]], - ['drawdetecteddiamonds_663',['drawDetectedDiamonds',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga0dbf27203267fb8e9f282554cf0d3433',1,'cv::aruco::drawDetectedDiamonds()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga0dbf27203267fb8e9f282554cf0d3433',1,'drawDetectedDiamonds()(Global Namespace)']]], - ['drawdetectedmarkers_664',['drawDetectedMarkers',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga2ad34b0f277edebb6a132d3069ed2909',1,'cv::aruco::drawDetectedMarkers()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga2ad34b0f277edebb6a132d3069ed2909',1,'drawDetectedMarkers()(Global Namespace)']]], - ['drawfacemarks_665',['drawFacemarks',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#ga318d9669d5ed4dfc6ab9fae2715310f5',1,'cv::face::drawFacemarks()'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#ga318d9669d5ed4dfc6ab9fae2715310f5',1,'drawFacemarks()(Global Namespace)']]], - ['drawfeatures_666',['drawFeatures',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0a8042ae6ca72f3da2f441be6e117bd9',1,'cv::linemod::drawFeatures()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0a8042ae6ca72f3da2f441be6e117bd9',1,'drawFeatures()(Global Namespace)']]], - ['drawframeaxes_667',['drawFrameAxes',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gab3ab7bb2bdfe7d5d9745bb92d13f9564',1,'cv::drawFrameAxes()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gab3ab7bb2bdfe7d5d9745bb92d13f9564',1,'drawFrameAxes(InputOutputArray image, InputArray cameraMatrix, InputArray distCoeffs, InputArray rvec, InputArray tvec, float length, int thickness=3)(Global Namespace)']]], - ['drawing_668',['Basic Drawing',['https://docs.opencv.org/4.2.0/d3/d96/tutorial_basic_geometric_drawing.html',1,'']]], - ['drawing_20and_20composition_20functionality_669',['G-API Drawing and composition functionality',['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'']]], - ['drawing_20function_20of_20keypoints_20and_20matches_670',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], - ['drawing_20functions_671',['Drawing Functions',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html',1,'']]], - ['drawing_20functions_20in_20opencv_672',['Drawing Functions in OpenCV',['https://docs.opencv.org/4.2.0/dc/da5/tutorial_py_drawing_functions.html',1,'']]], - ['drawing_20operations_20and_20functions_673',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], - ['drawing_20primitives_674',['Drawing primitives',['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html',1,'']]], - ['drawing_20utf_208_20strings_20with_20freetype_20harfbuzz_675',['Drawing UTF-8 strings with freetype/harfbuzz',['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html',1,'']]], - ['drawkeylines_676',['drawKeylines',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html#ga5e8cbc3c61c763a03474ce02141ce7e4',1,'cv::line_descriptor::drawKeylines()'],['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html#ga5e8cbc3c61c763a03474ce02141ce7e4',1,'drawKeylines()(Global Namespace)']]], - ['drawkeypoints_677',['drawKeypoints',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga5d2bafe8c1c45289bc3403a40fb88920',1,'cv::drawKeypoints()'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga5d2bafe8c1c45289bc3403a40fb88920',1,'drawKeypoints()(Global Namespace)']]], - ['drawlinematches_678',['drawLineMatches',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html#ga01e43c974ddb735d39dd7124499f40ab',1,'cv::line_descriptor::drawLineMatches()'],['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html#ga01e43c974ddb735d39dd7124499f40ab',1,'drawLineMatches()(Global Namespace)']]], - ['drawlinesmatchesflags_679',['DrawLinesMatchesFlags',['https://docs.opencv.org/4.2.0/d8/d6f/structcv_1_1line__descriptor_1_1DrawLinesMatchesFlags.html',1,'cv::line_descriptor']]], - ['drawmarker_680',['drawMarker',['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a3b3199ddd6c9ca7ed04c3bdf88477d15',1,'cv::aruco::Dictionary::drawMarker()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga644c4a170d4799a56b29f864ce984b7e',1,'cv::drawMarker()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga254ed245e10c5b3e2259d5d9b8ea8e2f',1,'cv::aruco::drawMarker()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga644c4a170d4799a56b29f864ce984b7e',1,'drawMarker(InputOutputArray img, Point position, const Scalar &color, int markerType=MARKER_CROSS, int markerSize=20, int thickness=1, int line_type=8)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga254ed245e10c5b3e2259d5d9b8ea8e2f',1,'drawMarker(const Ptr< Dictionary > &dictionary, int id, int sidePixels, OutputArray img, int borderBits=1)(Global Namespace)']]], - ['drawmatches_681',['drawMatches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#gad8f463ccaf0dc6f61083abd8717c261a',1,'cv::drawMatches(InputArray img1, const std::vector< KeyPoint > &keypoints1, InputArray img2, const std::vector< KeyPoint > &keypoints2, const std::vector< DMatch > &matches1to2, InputOutputArray outImg, const Scalar &matchColor=Scalar::all(-1), const Scalar &singlePointColor=Scalar::all(-1), const std::vector< char > &matchesMask=std::vector< char >(), DrawMatchesFlags flags=DrawMatchesFlags::DEFAULT)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga62fbedb5206ab2faf411797e7055c90f',1,'cv::drawMatches(InputArray img1, const std::vector< KeyPoint > &keypoints1, InputArray img2, const std::vector< KeyPoint > &keypoints2, const std::vector< std::vector< DMatch > > &matches1to2, InputOutputArray outImg, const Scalar &matchColor=Scalar::all(-1), const Scalar &singlePointColor=Scalar::all(-1), const std::vector< std::vector< char > > &matchesMask=std::vector< std::vector< char > >(), DrawMatchesFlags flags=DrawMatchesFlags::DEFAULT)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#gad8f463ccaf0dc6f61083abd8717c261a',1,'drawMatches(InputArray img1, const std::vector< KeyPoint > &keypoints1, InputArray img2, const std::vector< KeyPoint > &keypoints2, const std::vector< DMatch > &matches1to2, InputOutputArray outImg, const Scalar &matchColor=Scalar::all(-1), const Scalar &singlePointColor=Scalar::all(-1), const std::vector< char > &matchesMask=std::vector< char >(), DrawMatchesFlags flags=DrawMatchesFlags::DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga62fbedb5206ab2faf411797e7055c90f',1,'drawMatches(InputArray img1, const std::vector< KeyPoint > &keypoints1, InputArray img2, const std::vector< KeyPoint > &keypoints2, const std::vector< std::vector< DMatch > > &matches1to2, InputOutputArray outImg, const Scalar &matchColor=Scalar::all(-1), const Scalar &singlePointColor=Scalar::all(-1), const std::vector< std::vector< char > > &matchesMask=std::vector< std::vector< char > >(), DrawMatchesFlags flags=DrawMatchesFlags::DEFAULT)(Global Namespace)']]], - ['drawmatchesflags_682',['DrawMatchesFlags',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8',1,'cv::DrawMatchesFlags'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8',1,'DrawMatchesFlags(Global Namespace)']]], - ['draworientation_683',['drawOrientation',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a3ba4d56fe50a572e0edbd42e8ce246a6',1,'cv::ccalib::CustomPattern']]], - ['drawplanarboard_684',['drawPlanarBoard',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gacc98e7993d9f78c9eb1250f030896e85',1,'cv::aruco::drawPlanarBoard()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gacc98e7993d9f78c9eb1250f030896e85',1,'drawPlanarBoard()(Global Namespace)']]], - ['drawsegments_685',['drawSegments',['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1ximgproc_1_1FastLineDetector.html#aacfbe367964959be1173013f53912fc5',1,'cv::ximgproc::FastLineDetector::drawSegments()'],['https://docs.opencv.org/4.2.0/db/d73/classcv_1_1LineSegmentDetector.html#a1816a3c27f7c9b8d8acffec14451d4c4',1,'cv::LineSegmentDetector::drawSegments()']]], - ['drawsignature_686',['drawSignature',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a3e206c0847ce9f4474b6084deec1bc84',1,'cv::xfeatures2d::PCTSignatures']]], - ['driverversion_687',['driverVersion',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a370bb5033106a4f4feb09cc6813c566f',1,'cv::ocl::Device']]], - ['drivetowaypointcommand_688',['DriveToWaypointCommand',['../classcommands_1_1DriveToWaypointCommand.html',1,'commands::DriveToWaypointCommand'],['../classcommands_1_1DriveToWaypointCommand.html#ad0d25fcc0a835db6386bcaa2a1cbada9',1,'commands::DriveToWaypointCommand::DriveToWaypointCommand()']]], - ['drop_5fforgotten_5ftracks_689',['drop_forgotten_tracks',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#ad55c5f9a39a856f1be90df7abfe71ad3',1,'cv::tbm::TrackerParams']]], - ['dropforgottentrack_690',['dropForgottenTrack',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a4954acdfb5fbf5afa657a0ca65738975',1,'cv::tbm::ITrackerByMatching']]], - ['dropforgottentracks_691',['dropForgottenTracks',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#abd51c5e24d08a6011a8475006cbed972',1,'cv::tbm::ITrackerByMatching']]], - ['dropoutliers_692',['dropOutliers',['https://docs.opencv.org/4.2.0/d0/dba/classcv_1_1optflow_1_1GPCDetails.html#abeab00b6118efef02aae861afc12f5a0',1,'cv::optflow::GPCDetails']]], - ['dscreate_693',['dscreate',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a0f8b59fb69fc0ffeb2abb6e413d00885',1,'cv::hdf::HDF5::dscreate(const int rows, const int cols, const int type, const String &dslabel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#abe6abf5b602170b2f5f9a6553d6d3654',1,'cv::hdf::HDF5::dscreate(const int rows, const int cols, const int type, const String &dslabel, const int compresslevel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a77a0140c5df98a3969f0cae1bd6f20e1',1,'cv::hdf::HDF5::dscreate(const int rows, const int cols, const int type, const String &dslabel, const int compresslevel, const vector< int > &dims_chunks) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#adb40bb34c486048a1dd3a19f70a4bb32',1,'cv::hdf::HDF5::dscreate(const int rows, const int cols, const int type, const String &dslabel, const int compresslevel, const int *dims_chunks) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#ac92451730b86bc222ed9c859dc659d0f',1,'cv::hdf::HDF5::dscreate(const int n_dims, const int *sizes, const int type, const String &dslabel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#ae727e22a530c6bd624b36a8d2b72a889',1,'cv::hdf::HDF5::dscreate(const int n_dims, const int *sizes, const int type, const String &dslabel, const int compresslevel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#ab7b3aaab7b40babf5fa208c21a2a370b',1,'cv::hdf::HDF5::dscreate(const vector< int > &sizes, const int type, const String &dslabel, const int compresslevel=HDF5::H5_NONE, const vector< int > &dims_chunks=vector< int >()) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a56fa3b7affaa49cb0418895f572e2841',1,'cv::hdf::HDF5::dscreate(const int n_dims, const int *sizes, const int type, const String &dslabel, const int compresslevel, const int *dims_chunks) const=0']]], - ['dsgetsize_694',['dsgetsize',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a7bb2404c7381d5dd9c16f526dc780513',1,'cv::hdf::HDF5']]], - ['dsgettype_695',['dsgettype',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a6e718bd24804c3a47ac2df03294b5b60',1,'cv::hdf::HDF5']]], - ['dsinsert_696',['dsinsert',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a066531c8c803361851b278667f5442a7',1,'cv::hdf::HDF5::dsinsert(InputArray Array, const String &dslabel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#af3df2e41bad99a4b74c915567f84a3b0',1,'cv::hdf::HDF5::dsinsert(InputArray Array, const String &dslabel, const int *dims_offset) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a12a80b308989a80f72cdfe88f1b6e935',1,'cv::hdf::HDF5::dsinsert(InputArray Array, const String &dslabel, const vector< int > &dims_offset, const vector< int > &dims_counts=vector< int >()) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a8ed41a770f3b262ba62d8e51ff91e9bd',1,'cv::hdf::HDF5::dsinsert(InputArray Array, const String &dslabel, const int *dims_offset, const int *dims_counts) const=0']]], - ['dsread_697',['dsread',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#afc0f24683dbce852884f2147a68ddae3',1,'cv::hdf::HDF5::dsread(OutputArray Array, const String &dslabel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a6088901b1c715aad6164b27b83262479',1,'cv::hdf::HDF5::dsread(OutputArray Array, const String &dslabel, const int *dims_offset) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a849ed15c7d4697f562c2f230332b16fc',1,'cv::hdf::HDF5::dsread(OutputArray Array, const String &dslabel, const vector< int > &dims_offset, const vector< int > &dims_counts=vector< int >()) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a61e2bfc6d35271a160fdfec69c1a2157',1,'cv::hdf::HDF5::dsread(OutputArray Array, const String &dslabel, const int *dims_offset, const int *dims_counts) const=0']]], - ['dst_698',['dst',['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a5ff8f9c8577ce053ead74561ed861b07',1,'cv::MatxCommaInitializer::dst'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a5ff8f9c8577ce053ead74561ed861b07',1,'MatxCommaInitializer< _Tp, m, 1 >::dst']]], - ['dst_5f_699',['dst_',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#ad30226780c00964fa9278a9e8f1d4515',1,'cv::detail::Blender::dst_'],['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#a5dc38f7fd7af8f4a7d3cfbcd12ba0431',1,'cv::detail::Timelapser::dst_']]], - ['dst_5fimg_5fidx_700',['dst_img_idx',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#a1f0c77660d4fcff5caeacd18dda1fa7e',1,'cv::detail::MatchesInfo']]], - ['dst_5fmask_5f_701',['dst_mask_',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#a0104ca2f8e48ec1da37089a76129ff86',1,'cv::detail::Blender']]], - ['dst_5froi_5f_702',['dst_roi_',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#a2d4bafbbb6dd7e87882bf88128bdd92f',1,'cv::detail::Blender::dst_roi_'],['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#a63b3c97d45e3aa3dcbe3b62019b4849a',1,'cv::detail::Timelapser::dst_roi_']]], - ['dswrite_703',['dswrite',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#adc4bb3ba821d6ea52a7d8b6b9f623c85',1,'cv::hdf::HDF5::dswrite(InputArray Array, const String &dslabel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a575120ad1a8857b1fa2db4cb05488e81',1,'cv::hdf::HDF5::dswrite(InputArray Array, const String &dslabel, const int *dims_offset) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a996681e3faff692b8d94502164599ad3',1,'cv::hdf::HDF5::dswrite(InputArray Array, const String &dslabel, const vector< int > &dims_offset, const vector< int > &dims_counts=vector< int >()) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a0aa86fc0ec7a74dadd53da977ce0d181',1,'cv::hdf::HDF5::dswrite(InputArray Array, const String &dslabel, const int *dims_offset, const int *dims_counts) const=0']]], - ['dtf_5fic_704',['DTF_IC',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50ba750b04bda8b3a538f473695b3c6e4134',1,'cv::ximgproc::DTF_IC'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50ba750b04bda8b3a538f473695b3c6e4134',1,'DTF_IC(Global Namespace)']]], - ['dtf_5fnc_705',['DTF_NC',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50bae7471def53e472acdd9d5ff027f3b2d2',1,'cv::ximgproc::DTF_NC'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50bae7471def53e472acdd9d5ff027f3b2d2',1,'DTF_NC(Global Namespace)']]], - ['dtf_5frf_706',['DTF_RF',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50ba87c50252b836691c3aec0e7cee7e2c43',1,'cv::ximgproc::DTF_RF'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50ba87c50252b836691c3aec0e7cee7e2c43',1,'DTF_RF(Global Namespace)']]], - ['dtfilter_707',['DTFilter',['https://docs.opencv.org/4.2.0/d3/d9d/classcv_1_1ximgproc_1_1DTFilter.html',1,'cv::ximgproc']]], - ['dtfilter_708',['dtFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga420d830e628e79e8e8ba0f97c098b8b8',1,'cv::ximgproc::dtFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga420d830e628e79e8e8ba0f97c098b8b8',1,'dtFilter()(Global Namespace)']]], - ['dtrees_709',['DTrees',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html',1,'cv::ml']]], - ['dualtvl1opticalflow_710',['DualTVL1OpticalFlow',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html',1,'cv::optflow::DualTVL1OpticalFlow'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html',1,'cv::superres::DualTVL1OpticalFlow']]], - ['dummy_2eh_711',['dummy.h',['https://docs.opencv.org/4.2.0/d2/d94/dummy_8h.html',1,'']]], - ['dumnode_5fconst_5fiterator_712',['dumnode_const_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11659.html',1,'__gnu_pbds::detail']]], - ['dump_713',['dump',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#ac4d2758cc4cbf52564f8715645fa93a8',1,'cv::dnn::Net::dump()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a476756fb08e7f2416aad116d137977f4.html#a476756fb08e7f2416aad116d137977f4',1,'nlohmann::basic_json::dump()']]], - ['dumpbool_714',['dumpBool',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf80f610b81e838865974de31a2c7f632',1,'cv::utils::dumpBool()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf80f610b81e838865974de31a2c7f632',1,'dumpBool()(Global Namespace)']]], - ['dumpcstring_715',['dumpCString',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabc97db0a4f7f5675a47bab6c25384713',1,'cv::utils::dumpCString()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabc97db0a4f7f5675a47bab6c25384713',1,'dumpCString()(Global Namespace)']]], - ['dumpdouble_716',['dumpDouble',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga81eda02bc7fd9b7e5b656bab76ae0443',1,'cv::utils::dumpDouble()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga81eda02bc7fd9b7e5b656bab76ae0443',1,'dumpDouble()(Global Namespace)']]], - ['dumpfloat_717',['dumpFloat',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6510785b47105a8b2254d034b3d1a22c',1,'cv::utils::dumpFloat()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6510785b47105a8b2254d034b3d1a22c',1,'dumpFloat()(Global Namespace)']]], - ['dumpinputarray_718',['dumpInputArray',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabbbbf8c36017475930ae8817189e9fa6',1,'cv::utils::dumpInputArray()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabbbbf8c36017475930ae8817189e9fa6',1,'dumpInputArray()(Global Namespace)']]], - ['dumpinputarrayofarrays_719',['dumpInputArrayOfArrays',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabe4f2b9ed3bcc3988cc26e962d0d3eb7',1,'cv::utils::dumpInputArrayOfArrays()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabe4f2b9ed3bcc3988cc26e962d0d3eb7',1,'dumpInputArrayOfArrays()(Global Namespace)']]], - ['dumpinputoutputarray_720',['dumpInputOutputArray',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5cc7a521c0e256cb0e5a0236e3ed3f23',1,'cv::utils::dumpInputOutputArray()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5cc7a521c0e256cb0e5a0236e3ed3f23',1,'dumpInputOutputArray()(Global Namespace)']]], - ['dumpinputoutputarrayofarrays_721',['dumpInputOutputArrayOfArrays',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaa300bc8cdf4508113efe926f3fce7d72',1,'cv::utils::dumpInputOutputArrayOfArrays()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaa300bc8cdf4508113efe926f3fce7d72',1,'dumpInputOutputArrayOfArrays()(Global Namespace)']]], - ['dumpint_722',['dumpInt',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5a32f315f1a230c21820493ca48c21cb',1,'cv::utils::dumpInt()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5a32f315f1a230c21820493ca48c21cb',1,'dumpInt()(Global Namespace)']]], - ['dumpopenclinformation_723',['dumpOpenCLInformation',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a03e8f397da42cdf6c6c0d1c9cc0cb9f8',1,'cv']]], - ['dumpsizet_724',['dumpSizeT',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf17a637927d8015219f77b7c7f34741b',1,'cv::utils::dumpSizeT()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf17a637927d8015219f77b7c7f34741b',1,'dumpSizeT()(Global Namespace)']]], - ['dumptofile_725',['dumpToFile',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a4f7d0d1e650571e11d988d07f7ed5a7d',1,'cv::dnn::Net']]], - ['duration_726',['duration',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01839.html',1,'std::chrono']]], - ['duration_3c_20double_2c_20std_3a_3achrono_3a_3aseconds_3a_3aperiod_20_3e_727',['duration< double, std::chrono::seconds::period >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01839.html',1,'std::chrono']]], - ['duration_5fcast_728',['duration_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#a5143d479bd882a4ff638451dc57e49ed',1,'std::chrono']]], - ['duration_5fvalues_729',['duration_values',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01899.html',1,'std::chrono']]], - ['durationns_730',['durationNS',['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#a146c5d94482fa478c731265029ad7259',1,'cv::ocl::Timer']]], - ['durationtosec_731',['durationToSec',['../namespaceutil.html#a4d368bf202be12ecd7f66176f3088da3',1,'util']]], - ['dx_732',['dx',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#a518302f717934b076db95ff3b2172de3',1,'cv::datasets::FR_adienceObj::dx'],['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a2bd85a691e68108000f8daa23474784e',1,'cv::QtFont::dx']]], - ['dy_733',['dy',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#adbf87933fa98b33544838484513c1282',1,'cv::datasets::FR_adienceObj']]], - ['dynafu_734',['DynaFu',['https://docs.opencv.org/4.2.0/d1/d20/classcv_1_1dynafu_1_1DynaFu.html',1,'cv::dynafu']]], - ['dynafu_2ehpp_735',['dynafu.hpp',['https://docs.opencv.org/4.2.0/dc/dcf/dynafu_8hpp.html',1,'']]], - ['dynamic_736',['Dynamic',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad81fa7195215a0ce30017dfac309f0b2',1,'Eigen']]], - ['dynamic_20bitset_737',['Dynamic Bitset.',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html',1,'']]], - ['dynamic_20range_20hdr_738',['High Dynamic Range (HDR)',['https://docs.opencv.org/4.2.0/d2/df0/tutorial_py_hdr.html',1,'']]], - ['dynamic_20range_20imaging_739',['High Dynamic Range Imaging',['https://docs.opencv.org/4.2.0/d3/db7/tutorial_hdr_imaging.html',1,'']]], - ['dynamic_5fbitset_740',['dynamic_bitset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html',1,'std::tr2::dynamic_bitset< _WordT, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00995.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a37c4cf25cf2f0122ba3c952d5f4fb136',1,'std::tr2::dynamic_bitset::dynamic_bitset()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a14f9010fa71c5ff2382e8a81e2cb9187',1,'std::tr2::dynamic_bitset::dynamic_bitset(const allocator_type &__alloc)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a09163c15d91003865f72d3d11313daae',1,'std::tr2::dynamic_bitset::dynamic_bitset(size_type __nbits, unsigned long long __val=0ULL, const allocator_type &__alloc=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a83d4afb31d435543ed57f61f452c7ad5',1,'std::tr2::dynamic_bitset::dynamic_bitset(const std::basic_string< _CharT, _Traits, _Alloc1 > &__str, typename basic_string< _CharT, _Traits, _Alloc1 >::size_type __pos=0, typename basic_string< _CharT, _Traits, _Alloc1 >::size_type __n=std::basic_string< _CharT, _Traits, _Alloc1 >::npos, _CharT __zero=_CharT( '0'), _CharT __one=_CharT( '1'), const allocator_type &__alloc=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a4cfedc13b3f271fdf44774168e0f9178',1,'std::tr2::dynamic_bitset::dynamic_bitset(const char *__str, const allocator_type &__alloc=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a09f32eaa5007a2adc583f9dc1d8b807f',1,'std::tr2::dynamic_bitset::dynamic_bitset(const dynamic_bitset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aa8aa690fe197432110dfadbd8f055c13',1,'std::tr2::dynamic_bitset::dynamic_bitset(dynamic_bitset &&__b) noexcept']]], - ['dynamic_5fbitset_2eh_741',['dynamic_bitset.h',['https://docs.opencv.org/4.2.0/da/d5c/dynamic__bitset_8h.html',1,'']]], - ['dynamic_5fbitset_2etcc_742',['dynamic_bitset.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00989.html',1,'']]], - ['dynamic_5fparallelism_743',['DYNAMIC_PARALLELISM',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a2d8ef1fc50ce9e89ea1e058b6ba9df47',1,'cv::cuda::DYNAMIC_PARALLELISM'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a2d8ef1fc50ce9e89ea1e058b6ba9df47',1,'DYNAMIC_PARALLELISM(Global Namespace)']]], - ['dynamic_5fpointer_5fcast_744',['dynamic_pointer_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aea22d7ec8d3648b381cf98d0ba570e9b',1,'std']]], - ['dynamic_5fsmem_2ehpp_745',['dynamic_smem.hpp',['https://docs.opencv.org/4.2.0/d3/d73/modules_2core_2include_2opencv2_2core_2cuda_2dynamic__smem_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d15/contrib_2modules_2cudev_2include_2opencv2_2cudev_2block_2dynamic__smem_8hpp.html',1,'(Global Namespace)']]], - ['dynamicgop_746',['DynamicGOP',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#ae378f8c62fddf88f8b30a41e239d29e3',1,'cv::cudacodec::EncoderParams']]], - ['dynamicindex_747',['DynamicIndex',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a73c597189a4a99127175e8167c456fff',1,'Eigen']]], - ['dynamicsharedmem_748',['DynamicSharedMem',['https://docs.opencv.org/4.2.0/d3/d2b/structcv_1_1cudev_1_1DynamicSharedMem.html',1,'cv::cudev']]], - ['dynamicsharedmem_3c_20double_20_3e_749',['DynamicSharedMem< double >',['https://docs.opencv.org/4.2.0/db/d28/structcv_1_1cudev_1_1DynamicSharedMem_3_01double_01_4.html',1,'cv::cudev']]] + ['descrs_5fof_297',['descrs_of',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#aed6fe09a22fb5c37efd40b3446febb8f',1,'cv::descrs_of(const std::vector< cv::Mat > &vec)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a32ec103291faa0b7f1861e5571f1528b',1,'cv::descrs_of(const std::vector< cv::UMat > &vec)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a905279ccee2a6a4f48eae70f6021581f',1,'cv::gapi::own::descrs_of()']]], + ['design_20overview_298',['High-level design overview',['https://docs.opencv.org/4.2.0/de/d4d/gapi_hld.html',1,'']]], + ['destroy_299',['destroy',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#ac553ef7e1763033aedf0440dd7abed3d',1,'cv::Allocator::destroy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a38ff516ec60a94927ff485a81136a4da',1,'__alloc_traits< _Tp_alloc_type >::destroy(_Tp_alloc_type &__a, _Tp *__p) noexcept(noexcept(_S_destroy(__a, __p, 0)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a38ff516ec60a94927ff485a81136a4da',1,'__alloc_traits< _Tp_alloc_type >::destroy(_Tp_alloc_type &__a, _Tp *__p) noexcept(noexcept(_S_destroy(__a, __p, 0)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a38ff516ec60a94927ff485a81136a4da',1,'__gnu_cxx::__alloc_traits::destroy(_Alloc &__a, _Tp *__p) noexcept(noexcept(_S_destroy(__a, __p, 0)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a38ff516ec60a94927ff485a81136a4da',1,'__gnu_cxx::__alloc_traits::destroy(_Alloc &__a, _Tp *__p) noexcept(noexcept(_S_destroy(__a, __p, 0)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a38ff516ec60a94927ff485a81136a4da',1,'allocator_traits< _Tp_alloc_type >::destroy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a38ff516ec60a94927ff485a81136a4da',1,'std::allocator_traits::destroy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a1c5d9f61f7a45ae22097e147c0a56d5f',1,'std::allocator_traits< allocator< _Tp > >::destroy()']]], + ['destroyallwindows_300',['destroyAllWindows',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga6b7fc1c1a8960438156912027b38f481',1,'cv::destroyAllWindows()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga6b7fc1c1a8960438156912027b38f481',1,'destroyAllWindows()(Global Namespace)']]], + ['destroyflann_301',['destroyFlann',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga439450ce38dae0b87bf497c50d6211e9',1,'cv::ppf_match_3d::destroyFlann()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga439450ce38dae0b87bf497c50d6211e9',1,'destroyFlann()(Global Namespace)']]], + ['destroywindow_302',['destroyWindow',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga851ccdd6961022d1d5b4c4f255dbab34',1,'cv::destroyWindow()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga851ccdd6961022d1d5b4c4f255dbab34',1,'destroyWindow()(Global Namespace)']]], + ['det_303',['det',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#ad810e03e0ed2e12d738648eaca2540c1',1,'cv::cuda::SURF_CUDA']]], + ['detachdata_304',['detachData',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#aa40ccce3dca12ada46d0f02d99866690',1,'cv::TLSDataAccumulator::detachData()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#aa40ccce3dca12ada46d0f02d99866690',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::detachData()'],['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#a218e191c933c04e57c3f05b6525c9800',1,'cv::TLSDataContainer::detachData()']]], + ['detail_3a_3aexternal_5fconstructor_305',['external_constructor',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6275ed57bae6866cdf5db5370a7ad47c.html#a6275ed57bae6866cdf5db5370a7ad47c',1,'nlohmann::basic_json']]], + ['detailenhance_306',['detailEnhance',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ga0de660cb6f371a464a74c7b651415975',1,'cv::detailEnhance()'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ga0de660cb6f371a464a74c7b651415975',1,'detailEnhance(InputArray src, OutputArray dst, float sigma_s=10, float sigma_r=0.15f)(Global Namespace)']]], + ['details_307',['Implementation details',['https://docs.opencv.org/4.2.0/d4/ddd/gapi_impl.html',1,'']]], + ['detect_308',['detect',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1xfeatures2d_1_1AffineFeature2D.html#ad5b29ff43bad6c2dc4d18df9843f3ad7',1,'cv::xfeatures2d::AffineFeature2D::detect()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a64ab14e3d9878232bcb33baa50e2d3e3',1,'cv::line_descriptor::BinaryDescriptor::detect(const Mat &image, std::vector< KeyLine > &keypoints, const Mat &mask=Mat())'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a10aa6eae160d52654983880b83e6fbd2',1,'cv::line_descriptor::BinaryDescriptor::detect(const std::vector< Mat > &images, std::vector< std::vector< KeyLine > > &keylines, const std::vector< Mat > &masks=std::vector< Mat >()) const'],['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html#a6438cf8453f2dfd6703ceb50056de309',1,'cv::cuda::CannyEdgeDetector::detect(InputArray image, OutputArray edges, Stream &stream=Stream::Null())=0'],['https://docs.opencv.org/4.2.0/d0/d43/classcv_1_1cuda_1_1CannyEdgeDetector.html#aa699764fed242de08abe97f6ee06a599',1,'cv::cuda::CannyEdgeDetector::detect(InputArray dx, InputArray dy, OutputArray edges, Stream &stream=Stream::Null())=0'],['https://docs.opencv.org/4.2.0/de/d95/classcv_1_1cuda_1_1CornersDetector.html#a3a103ca6d48c51840d31397730a692aa',1,'cv::cuda::CornersDetector::detect()'],['https://docs.opencv.org/4.2.0/d3/df1/classcv_1_1dnn_1_1DetectionModel.html#aca8d52a761b41576e3798b1a92e70a9a',1,'cv::dnn::DetectionModel::detect()'],['https://docs.opencv.org/4.2.0/df/dba/classcv_1_1dpm_1_1DPMDetector.html#aedf0cc6120afb1142d7e402b667791df',1,'cv::dpm::DPMDetector::detect()'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1ximgproc_1_1FastLineDetector.html#a10d3ce6ef6bce92818d1f919e2b2aa57',1,'cv::ximgproc::FastLineDetector::detect()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#aa4e9a7082ec61ebc108806704fbd7887',1,'cv::Feature2D::detect(InputArray image, std::vector< KeyPoint > &keypoints, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a5968e9bc8497a8eb845272b9442559f3',1,'cv::Feature2D::detect(InputArrayOfArrays images, std::vector< std::vector< KeyPoint > > &keypoints, InputArrayOfArrays masks=noArray())'],['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a42efe58575412b02c1a6642fe5b22d5b',1,'cv::GeneralizedHough::detect(InputArray image, OutputArray positions, OutputArray votes=noArray())=0'],['https://docs.opencv.org/4.2.0/d7/dd4/classcv_1_1GeneralizedHough.html#a07fc9a22f1a97b9dbe29c879c6efe803',1,'cv::GeneralizedHough::detect(InputArray edges, InputArray dx, InputArray dy, OutputArray positions, OutputArray votes=noArray())=0'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#a6673d9c05926ea11e0070c8ee4145664',1,'cv::cuda::HOG::detect()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a5851df61c5b95391533144c078403672',1,'cv::HOGDescriptor::detect(InputArray img, std::vector< Point > &foundLocations, std::vector< double > &weights, double hitThreshold=0, Size winStride=Size(), Size padding=Size(), const std::vector< Point > &searchLocations=std::vector< Point >()) const'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a309829908ffaf4645755729d7aa90627',1,'cv::HOGDescriptor::detect(InputArray img, std::vector< Point > &foundLocations, double hitThreshold=0, Size winStride=Size(), Size padding=Size(), const std::vector< Point > &searchLocations=std::vector< Point >()) const'],['https://docs.opencv.org/4.2.0/da/d80/classcv_1_1cuda_1_1HoughCirclesDetector.html#ae4c9aa668b46bb497175af3c15b34f72',1,'cv::cuda::HoughCirclesDetector::detect()'],['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#a18ff6d0886833ac6215054e191ae2520',1,'cv::cuda::HoughLinesDetector::detect()'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1cuda_1_1HoughSegmentDetector.html#a739bf84825ca455966d69dd75ca0ea6e',1,'cv::cuda::HoughSegmentDetector::detect()'],['https://docs.opencv.org/4.2.0/d8/da6/classcv_1_1DetectionBasedTracker_1_1IDetector.html#ae613e0c9a09698523280299e1bb02b5d',1,'cv::DetectionBasedTracker::IDetector::detect()'],['https://docs.opencv.org/4.2.0/db/d73/classcv_1_1LineSegmentDetector.html#a1bbd8f90f6feb4d673d1a1bc614a667c',1,'cv::LineSegmentDetector::detect()'],['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#aedaabd0a9c1c465c5b7d80b67374a73b',1,'cv::line_descriptor::LSDDetector::detect(const Mat &image, std::vector< KeyLine > &keypoints, int scale, int numOctaves, const Mat &mask=Mat())'],['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#a30ee653e83fed71ec048050619b2f469',1,'cv::line_descriptor::LSDDetector::detect(const std::vector< Mat > &images, std::vector< std::vector< KeyLine > > &keylines, int scale, int numOctaves, const std::vector< Mat > &masks=std::vector< Mat >()) const'],['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a64373f7d877d27473f64fe04bb57d22b',1,'cv::QRCodeDetector::detect()'],['https://docs.opencv.org/4.2.0/de/d25/classcv_1_1text_1_1TextDetector.html#a01b63eca18aca77d9d4e2ce5e8f76bac',1,'cv::text::TextDetector::detect()'],['https://docs.opencv.org/4.2.0/d1/d66/classcv_1_1text_1_1TextDetectorCNN.html#ac935f5cbfc3305784626d2fa4e49bb25',1,'cv::text::TextDetectorCNN::detect()'],['https://docs.opencv.org/4.2.0/de/d0e/classcv_1_1xobjdetect_1_1WBDetector.html#ad19680e6545f49a9ca42dfc3457319e2',1,'cv::xobjdetect::WBDetector::detect()']]], + ['detect_5fthresh_309',['detect_thresh',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#af7c297a918719441a448181626488eb0',1,'cv::TrackerKCF::Params']]], + ['detectandcompute_310',['detectAndCompute',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1xfeatures2d_1_1AffineFeature2D.html#a96d437af348dc676a3860d755555a249',1,'cv::xfeatures2d::AffineFeature2D::detectAndCompute()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#a8be0d1c20b08eb867184b8d74c15a677',1,'cv::Feature2D::detectAndCompute()']]], + ['detectandcomputeasync_311',['detectAndComputeAsync',['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1cuda_1_1Feature2DAsync.html#a56c6c75e25e9616934c25552164a363c',1,'cv::cuda::Feature2DAsync']]], + ['detectanddecode_312',['detectAndDecode',['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a7290bd6a5d59b14a37979c3a14fbf394',1,'cv::QRCodeDetector']]], + ['detectasync_313',['detectAsync',['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1cuda_1_1Feature2DAsync.html#ae8e813808fdd7c647c39312d4fbe89b1',1,'cv::cuda::Feature2DAsync']]], + ['detectcharucodiamond_314',['detectCharucoDiamond',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gaade474aa951d02470c34ddbb91d851ea',1,'cv::aruco::detectCharucoDiamond()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gaade474aa951d02470c34ddbb91d851ea',1,'detectCharucoDiamond()(Global Namespace)']]], + ['detected_315',['DETECTED',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ad43563cc5b954817ad5078f995afd3ffa9828525838cee9776655ebbd2211d3e7',1,'cv::DetectionBasedTracker']]], + ['detected_5fnot_5fshown_5fyet_316',['DETECTED_NOT_SHOWN_YET',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ad43563cc5b954817ad5078f995afd3ffab57bc255a72bcaa7b49c2c3c6b4257d7',1,'cv::DetectionBasedTracker']]], + ['detected_5ftemporary_5flost_317',['DETECTED_TEMPORARY_LOST',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ad43563cc5b954817ad5078f995afd3ffa6d5ec140e9ee103752c5356d95504694',1,'cv::DetectionBasedTracker']]], + ['detectedges_318',['detectEdges',['https://docs.opencv.org/4.2.0/d8/d54/classcv_1_1ximgproc_1_1StructuredEdgeDetection.html#a1f01d212a7d86da6811e85c1b5b17385',1,'cv::ximgproc::StructuredEdgeDetection']]], + ['detectimpl_319',['detectImpl',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#a53b8eab4609b8ee0b49f294d7aef5672',1,'cv::line_descriptor::BinaryDescriptor']]], + ['detecting_20corners_20location_20in_20subpixels_320',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], + ['detectinregion_321',['detectInRegion',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#a60322c607da2e8cc127fac6c0461394d',1,'cv::DetectionBasedTracker']]], + ['detectinvertedmarker_322',['detectInvertedMarker',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#acc98709d31f1b86c31b18c7200b60909',1,'cv::aruco::DetectorParameters']]], + ['detection_323',['Detection',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html',1,'ArUco Marker Detection'],['https://docs.opencv.org/4.2.0/da/d22/tutorial_py_canny.html',1,'Canny Edge Detection'],['https://docs.opencv.org/4.2.0/d7/de1/tutorial_js_canny.html',1,'Canny Edge Detection'],['https://docs.opencv.org/4.2.0/df/d0c/tutorial_py_fast.html',1,'FAST Algorithm for Corner Detection'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/d7/d66/tutorial_feature_detection.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/dc/d0d/tutorial_py_features_harris.html',1,'Harris Corner Detection'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d9/d3f/group__cudaobjdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d9/de5/tutorial_py_table_of_contents_objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/dc/d73/tutorial_js_table_of_contents_objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html',1,'Pedestrian Detection'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html',1,'Scene Text Detection']]], + ['detection_324',['detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'DNN used for object detection'],['https://docs.opencv.org/4.2.0/d4/d54/group__xobjdetect.html',1,'Extended object detection'],['https://docs.opencv.org/4.2.0/d1/d52/tutorial_face_swapping_face_landmark_detection.html',1,'Face swapping using face landmark detection'],['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html',1,'Structured forests for fast edge detection'],['https://docs.opencv.org/4.2.0/d0/da5/tutorial_ximgproc_prediction.html',1,'Structured forests for fast edge detection']]], + ['detection_20and_20description_325',['Detection and Description',['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/db/d27/tutorial_py_table_of_contents_feature2d.html',1,'Feature Detection and Description']]], + ['detection_20and_20recognition_326',['Scene Text Detection and Recognition',['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'']]], + ['detection_20aruco_20module_327',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], + ['detection_20in_20a_20video_328',['Face landmark detection in a video',['https://docs.opencv.org/4.2.0/d8/d3c/tutorial_face_landmark_detection_in_video.html',1,'']]], + ['detection_20in_20an_20image_329',['Face landmark detection in an image',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'']]], + ['detection_20in_20video_20capture_330',['Face Detection in Video Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'']]], + ['detection_20objdetect_20module_331',['Object Detection (objdetect module)',['https://docs.opencv.org/4.2.0/d2/d64/tutorial_table_of_content_objdetect.html',1,'']]], + ['detection_20of_20aruco_20boards_332',['Detection of ArUco Boards',['https://docs.opencv.org/4.2.0/db/da9/tutorial_aruco_board_detection.html',1,'']]], + ['detection_20of_20aruco_20markers_333',['Detection of ArUco Markers',['https://docs.opencv.org/4.2.0/d5/dae/tutorial_aruco_detection.html',1,'']]], + ['detection_20of_20charuco_20corners_334',['Detection of ChArUco Corners',['https://docs.opencv.org/4.2.0/df/d4a/tutorial_charuco_detection.html',1,'']]], + ['detection_20of_20diamond_20markers_335',['Detection of Diamond Markers',['https://docs.opencv.org/4.2.0/d5/d07/tutorial_charuco_diamond_detection.html',1,'']]], + ['detection_20of_20planar_20objects_336',['Detection of planar objects',['https://docs.opencv.org/4.2.0/dd/dd4/tutorial_detection_of_planar_objects.html',1,'']]], + ['detection_20using_20cnns_337',['Object Detection using CNNs',['https://docs.opencv.org/4.2.0/d2/da2/tutorial_dnn_objdetect.html',1,'']]], + ['detection_20using_20haar_20cascades_338',['Detection using Haar Cascades',['https://docs.opencv.org/4.2.0/d7/d8b/tutorial_py_face_detection.html',1,'Face Detection using Haar Cascades'],['https://docs.opencv.org/4.2.0/d2/d99/tutorial_js_face_detection.html',1,'Face Detection using Haar Cascades']]], + ['detection_5fbased_5ftracker_2ehpp_339',['detection_based_tracker.hpp',['https://docs.opencv.org/4.2.0/d5/d5a/detection__based__tracker_8hpp.html',1,'']]], + ['detection_5fof_5fplanar_5fobjects_2emarkdown_340',['detection_of_planar_objects.markdown',['https://docs.opencv.org/4.2.0/dd/d5c/detection__of__planar__objects_8markdown.html',1,'']]], + ['detectionbasedtracker_341',['DetectionBasedTracker',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html',1,'cv::DetectionBasedTracker'],['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#aab415fa71206b900ad52ae650ab96636',1,'cv::DetectionBasedTracker::DetectionBasedTracker()']]], + ['detectionmodel_342',['DetectionModel',['https://docs.opencv.org/4.2.0/d3/df1/classcv_1_1dnn_1_1DetectionModel.html',1,'cv::dnn::DetectionModel'],['https://docs.opencv.org/4.2.0/d3/df1/classcv_1_1dnn_1_1DetectionModel.html#a17cf756617d807631640bdc6ff294ed6',1,'cv::dnn::DetectionModel::DetectionModel(const String &model, const String &config="")'],['https://docs.opencv.org/4.2.0/d3/df1/classcv_1_1dnn_1_1DetectionModel.html#af931afb45587f22a60227434f2babab5',1,'cv::dnn::DetectionModel::DetectionModel(const Net &network)']]], + ['detectionoutputlayer_343',['DetectionOutputLayer',['https://docs.opencv.org/4.2.0/da/dbd/classcv_1_1dnn_1_1DetectionOutputLayer.html',1,'cv::dnn']]], + ['detectionroi_344',['DetectionROI',['https://docs.opencv.org/4.2.0/d3/d34/structcv_1_1DetectionROI.html',1,'cv']]], + ['detections_345',['detections',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a538ca4168bb84e270b592eacb13ed5fc',1,'cv::dnn_objdetect::InferBbox']]], + ['detectmarkers_346',['detectMarkers',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gab9159aa69250d8d3642593e508cb6baa',1,'cv::aruco::detectMarkers()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gab9159aa69250d8d3642593e508cb6baa',1,'detectMarkers()(Global Namespace)']]], + ['detectmultiscale_347',['detectMultiScale',['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#aa4c96739e441adda5005ae58fd95a5a2',1,'cv::BaseCascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, double scaleFactor, int minNeighbors, int flags, Size minSize, Size maxSize)=0'],['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#a68623391e16daa264f089af99d8d4bbb',1,'cv::BaseCascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, std::vector< int > &numDetections, double scaleFactor, int minNeighbors, int flags, Size minSize, Size maxSize)=0'],['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#afa5ead715ec7c9cf0ef71f210ba7715f',1,'cv::BaseCascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, std::vector< int > &rejectLevels, std::vector< double > &levelWeights, double scaleFactor, int minNeighbors, int flags, Size minSize, Size maxSize, bool outputRejectLevels)=0'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#aaf8181cb63968136476ec4204ffca498',1,'cv::CascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, double scaleFactor=1.1, int minNeighbors=3, int flags=0, Size minSize=Size(), Size maxSize=Size())'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a90fe1b7778bed4a27aa8482e1eecc116',1,'cv::CascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, std::vector< int > &numDetections, double scaleFactor=1.1, int minNeighbors=3, int flags=0, Size minSize=Size(), Size maxSize=Size())'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#accf96d130d9f3cf4c58bf445b7861c19',1,'cv::CascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, std::vector< int > &rejectLevels, std::vector< double > &levelWeights, double scaleFactor=1.1, int minNeighbors=3, int flags=0, Size minSize=Size(), Size maxSize=Size(), bool outputRejectLevels=false)'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a182656b878046eb3f0e9c0f0ee327f08',1,'cv::cuda::CascadeClassifier::detectMultiScale()'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#af4a3bf27a5a04817c6d584d9108f50b7',1,'cv::cuda::HOG::detectMultiScale()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a91e56a2c317392e50fbaa2f5dc78d30b',1,'cv::HOGDescriptor::detectMultiScale(InputArray img, std::vector< Rect > &foundLocations, std::vector< double > &foundWeights, double hitThreshold=0, Size winStride=Size(), Size padding=Size(), double scale=1.05, double finalThreshold=2.0, bool useMeanshiftGrouping=false) const'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a660e5cd036fd5ddf0f5767b352acd948',1,'cv::HOGDescriptor::detectMultiScale(InputArray img, std::vector< Rect > &foundLocations, double hitThreshold=0, Size winStride=Size(), Size padding=Size(), double scale=1.05, double finalThreshold=2.0, bool useMeanshiftGrouping=false) const']]], + ['detectmultiscaleroi_348',['detectMultiScaleROI',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a40aabc4ac4dbab3a855ae9182b91ef73',1,'cv::HOGDescriptor']]], + ['detector_349',['Detector',['https://docs.opencv.org/4.2.0/da/d5c/tutorial_canny_detector.html',1,'Canny Edge Detector'],['../classAR_1_1Detector.html',1,'AR::Detector'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1Detector.html',1,'cv::Detector'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html',1,'cv::linemod::Detector'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a5f60b6ace07d2435f92b6a2353ff5b08',1,'cv::linemod::Detector::Detector()'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#af509761698a542228b047865cc88c996',1,'cv::linemod::Detector::Detector(const std::vector< Ptr< Modality > > &modalities, const std::vector< int > &T_pyramid)'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1Detector.html#a5f1f484e448dc9488dc9643bd6c289ef',1,'cv::Detector::Detector()']]], + ['detector_350',['detector',['https://docs.opencv.org/4.2.0/d9/dbc/tutorial_generic_corner_detector.html',1,'Creating your own corner detector'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a7d8e71a4a08b41f897151b6ef190c61e',1,'cv::videostab::KeypointBasedMotionEstimator::detector()'],['https://docs.opencv.org/4.2.0/df/ded/group__ximgproc__fast__line__detector.html',1,'Fast line detector'],['https://docs.opencv.org/4.2.0/d4/d7d/tutorial_harris_detector.html',1,'Harris corner detector'],['https://docs.opencv.org/4.2.0/d8/dd8/tutorial_good_features_to_track.html',1,'Shi-Tomasi corner detector']]], + ['detector_20api_351',['Tutorial on Facial Landmark Detector API',['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'']]], + ['detector_20good_20features_20to_20track_352',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], + ['detectorparameters_353',['DetectorParameters',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html',1,'cv::aruco::DetectorParameters'],['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a12c71ac3314cb086054c963be50d9eeb',1,'cv::aruco::DetectorParameters::DetectorParameters()']]], + ['detectortype_354',['DetectorType',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#ae9a22560b2cc9c99b3a3de82ac4af7d3',1,'cv::AgastFeatureDetector::DetectorType'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08',1,'cv::FastFeatureDetector::DetectorType']]], + ['detectregions_355',['detectRegions',['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#a49d72a1346413106516a7fc6d95c09bb',1,'cv::MSER::detectRegions()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gac4abe0243775e0d1a871a7d85fde0198',1,'cv::text::detectRegions(InputArray image, const Ptr< ERFilter > &er_filter1, const Ptr< ERFilter > &er_filter2, std::vector< std::vector< Point > > &regions)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gacead6485d0966726892094fc4aaf9dc6',1,'cv::text::detectRegions(InputArray image, const Ptr< ERFilter > &er_filter1, const Ptr< ERFilter > &er_filter2, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const String &filename=String(), float minProbability=(float) 0.5)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gac4abe0243775e0d1a871a7d85fde0198',1,'detectRegions(InputArray image, const Ptr< ERFilter > &er_filter1, const Ptr< ERFilter > &er_filter2, std::vector< std::vector< Point > > &regions)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gacead6485d0966726892094fc4aaf9dc6',1,'detectRegions(InputArray image, const Ptr< ERFilter > &er_filter1, const Ptr< ERFilter > &er_filter2, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const String &filename=String(), float minProbability=(float) 0.5)(Global Namespace)']]], + ['detectresultroi_356',['detectResultRoi',['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1detail_1_1CylindricalPortraitWarper.html#a7bd422c0430eafe4949be6933e24c7de',1,'cv::detail::CylindricalPortraitWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d3/dd6/classcv_1_1detail_1_1CylindricalWarper.html#aaccd0166c4d8ee1329288aa90bacc2c6',1,'cv::detail::CylindricalWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d9/d77/classcv_1_1detail_1_1PlanePortraitWarper.html#a5da8cdd9f86f09630634953de834852f',1,'cv::detail::PlanePortraitWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d3/d3d/classcv_1_1detail_1_1PlaneWarper.html#a838a61c562086c39c02042892765dd40',1,'cv::detail::PlaneWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'cv::detail::RotationWarperBase::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< CompressedRectilinearPortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< CompressedRectilinearProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< CylindricalPortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< CylindricalProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< FisheyeProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< MercatorProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< PaniniPortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< PaniniProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< PlanePortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< PlaneProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< SphericalPortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< SphericalProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< StereographicProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< TransverseMercatorProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d8/d70/classcv_1_1detail_1_1SphericalPortraitWarper.html#ab80c05230879653492a6da365b727658',1,'cv::detail::SphericalPortraitWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/dd0/classcv_1_1detail_1_1SphericalWarper.html#ab56a9a30d19d301f6c5cb097144699ef',1,'cv::detail::SphericalWarper::detectResultRoi()']]], + ['detectresultroibyborder_357',['detectResultRoiByBorder',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'cv::detail::RotationWarperBase::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< CompressedRectilinearPortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< CompressedRectilinearProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< CylindricalPortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< CylindricalProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< FisheyeProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< MercatorProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< PaniniPortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< PaniniProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< PlanePortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< PlaneProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< SphericalPortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< SphericalProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< StereographicProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< TransverseMercatorProjector >::detectResultRoiByBorder()']]], + ['detectroi_358',['detectROI',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a83ba7e8bd6e4b3bc6aa1aafc68659460',1,'cv::face::FacemarkLBF::Params::detectROI'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a26a3085d2f461f22b98c7b6066f51d3e',1,'cv::HOGDescriptor::detectROI()']]], + ['determinant_359',['determinant',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'Eigen::CholmodBase::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a71654e5c60a26407ecccfaa5b34bb0aa',1,'Eigen::FullPivLU::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ad8f77004bb956b603bb43fd2e3c061',1,'Eigen::MatrixBase::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ad8f77004bb956b603bb43fd2e3c061',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ad8f77004bb956b603bb43fd2e3c061',1,'MatrixBase< Solve< Decomposition, RhsType > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a54c3d39c9b46ff485a8d2140b9b23193',1,'Eigen::PartialPivLU::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'Eigen::PermutationBase::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'PermutationBase< PermutationWrapper< _IndicesType > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a29e14dd450da71659b599ce53c6c0bd1',1,'Eigen::SimplicialLDLT::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a05a34e5f9da53de1205780bd991b310d',1,'Eigen::SimplicialLLT::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a9648e81c2d0264abb5996f75b7e0b569',1,'Eigen::SparseLU::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ab8cd6bfc705c0c05a6755ae7437376f9',1,'Eigen::TriangularView::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ab8cd6bfc705c0c05a6755ae7437376f9',1,'TriangularView< const Derived, Mode >::determinant()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga06b8ec936c3cbc9502d76c7818053b41',1,'cv::determinant(const Matx< _Tp, m, m > &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf802bd9ca3e07b8b6170645ef0611d0c',1,'cv::determinant(InputArray mtx)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga06b8ec936c3cbc9502d76c7818053b41',1,'determinant(const Matx< _Tp, m, m > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf802bd9ca3e07b8b6170645ef0611d0c',1,'determinant(InputArray mtx)(Global Namespace)']]], + ['dev_5fid_360',['dev_id',['https://docs.opencv.org/4.2.0/de/d39/structcv_1_1gapi_1_1plaidml_1_1config.html#abbdf5cd394a6a6a761e25e6512eda752',1,'cv::gapi::plaidml::config']]], + ['dev_5fwith_5focv_5fon_5fandroid_2emarkdown_361',['dev_with_OCV_on_Android.markdown',['https://docs.opencv.org/4.2.0/d9/d37/dev__with__OCV__on__Android_8markdown.html',1,'']]], + ['development_362',['Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'Introduction into Android Development'],['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'Introduction to Java Development']]], + ['development_20with_20clojure_363',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], + ['development_20with_20opencv_364',['Android Development with OpenCV',['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'']]], + ['device_365',['Device',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html',1,'cv::ocl::Device'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ae14a69abe6d37c41a3a9d32e7e77fded',1,'cv::ocl::Device::Device()'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2aeda46f7bf9502aa3863eee5fc664ea',1,'cv::ocl::Device::Device(void *d)'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0a0cec7084b4e2b942f34709123b734b',1,'cv::ocl::Device::Device(const Device &d)']]], + ['device_366',['device',['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#adf7dfe6389a254b59e90520ab3c7c4fc',1,'cv::ocl::Context::device()'],['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'How to run deep networks on Android device']]], + ['device_20layer_367',['Device layer',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html',1,'']]], + ['device_5fcopy_5fobsolete_368',['DEVICE_COPY_OBSOLETE',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12a6d7b602a6172c5f2ef277515338aba79',1,'cv::UMatData']]], + ['device_5fid_369',['device_id',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#a6cedf45e3d8bde8ed5bde5b79ff08987',1,'cv::gapi::ie::detail::ParamDesc']]], + ['device_5fmem_5fmapped_370',['DEVICE_MEM_MAPPED',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12a1492fb3c927472e59cc64ba1383cd8bc',1,'cv::UMatData']]], + ['devicecopyobsolete_371',['deviceCopyObsolete',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a637d69a885ec00d4d69559efb748fa6b',1,'cv::UMatData']]], + ['devicegroup_5ft_372',['devicegroup_t',['../namespacecan.html#a1b499367fdbe137b795e3bde15a57e86',1,'can']]], + ['deviceid_373',['deviceID',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ad58f770aa964e967e8dfc5b97913e067',1,'cv::cuda::DeviceInfo']]], + ['deviceid_5ft_374',['deviceid_t',['../namespacecan.html#ae87a3af67a7f6b9a37bdb4c3e6089b10',1,'can']]], + ['deviceinfo_375',['DeviceInfo',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html',1,'cv::cuda::DeviceInfo'],['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a6ca8e4843a1724e7c525cdcd3cd2f936',1,'cv::cuda::DeviceInfo::DeviceInfo()'],['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a41fe9bf431cd452520183c79620e1d94',1,'cv::cuda::DeviceInfo::DeviceInfo(int device_id)']]], + ['devicememmapped_376',['deviceMemMapped',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#acf725c681271182c34317ac7686b415e',1,'cv::UMatData']]], + ['devicenumber_377',['deviceNumber',['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#a5d10dd0ac83091325dd807ccf18983ff',1,'cv::ocl::PlatformInfo']]], + ['deviceserial_5ft_378',['deviceserial_t',['../namespacecan.html#ad9e11e8dde365a609487743b3ebf7cd0',1,'can']]], + ['devicesupports_379',['deviceSupports',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga170b10cc9af4aa8cce8c0afdb4b1d08c',1,'cv::cuda::deviceSupports()'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga170b10cc9af4aa8cce8c0afdb4b1d08c',1,'deviceSupports()(Global Namespace)']]], + ['deviceversionmajor_380',['deviceVersionMajor',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2c3c441c506d3017373a96a6883a8cd1',1,'cv::ocl::Device']]], + ['deviceversionminor_381',['deviceVersionMinor',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#af81d10a813a6cc4951b0626ad238ad23',1,'cv::ocl::Device']]], + ['dextractor_382',['dextractor',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#acd0f100ac2f377432931062ce02f16cb',1,'cv::BOWImgDescriptorExtractor']]], + ['dft_383',['DFT',['https://docs.opencv.org/4.2.0/dc/de5/classcv_1_1cuda_1_1DFT.html',1,'cv::cuda']]], + ['dft_384',['dft',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadd6cf9baf2b8b704a11b5f04aaf4f39d',1,'cv::dft()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#gadea99cb15a715c983bcc2870d65a2e78',1,'cv::cuda::dft()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadd6cf9baf2b8b704a11b5f04aaf4f39d',1,'dft(InputArray src, OutputArray dst, int flags=0, int nonzeroRows=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#gadea99cb15a715c983bcc2870d65a2e78',1,'dft(InputArray src, OutputArray dst, Size dft_size, int flags=0, Stream &stream=Stream::Null())(Global Namespace)']]], + ['dft1d_385',['DFT1D',['https://docs.opencv.org/4.2.0/d8/d03/structcv_1_1hal_1_1DFT1D.html',1,'cv::hal']]], + ['dft2d_386',['DFT2D',['https://docs.opencv.org/4.2.0/d6/d77/structcv_1_1hal_1_1DFT2D.html',1,'cv::hal']]], + ['dft_5fcomplex_5finput_387',['DFT_COMPLEX_INPUT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1caa5ccb5f191a65e2d11a5ceba1f886efd',1,'cv::DFT_COMPLEX_INPUT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1caa5ccb5f191a65e2d11a5ceba1f886efd',1,'DFT_COMPLEX_INPUT(Global Namespace)']]], + ['dft_5fcomplex_5foutput_388',['DFT_COMPLEX_OUTPUT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca07b45079b38d60e7837dfb666a55299b',1,'cv::DFT_COMPLEX_OUTPUT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca07b45079b38d60e7837dfb666a55299b',1,'DFT_COMPLEX_OUTPUT(Global Namespace)']]], + ['dft_5finverse_389',['DFT_INVERSE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca4e01d7e91cae1dbb68a26767d7b636be',1,'cv::DFT_INVERSE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca4e01d7e91cae1dbb68a26767d7b636be',1,'DFT_INVERSE(Global Namespace)']]], + ['dft_5freal_5foutput_390',['DFT_REAL_OUTPUT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca28347c7846e5eaed83e019cd003e8e03',1,'cv::DFT_REAL_OUTPUT'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca28347c7846e5eaed83e019cd003e8e03',1,'DFT_REAL_OUTPUT(Global Namespace)']]], + ['dft_5frows_391',['DFT_ROWS',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca1744dc1cf1249944bc841e78c1565b7f',1,'cv::DFT_ROWS'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca1744dc1cf1249944bc841e78c1565b7f',1,'DFT_ROWS(Global Namespace)']]], + ['dft_5fscale_392',['DFT_SCALE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca74746fb171aa4bfc08ace28d73f52375',1,'cv::DFT_SCALE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggaf4dde112b483b38175621befedda1f1ca74746fb171aa4bfc08ace28d73f52375',1,'DFT_SCALE(Global Namespace)']]], + ['dftflags_393',['DftFlags',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf4dde112b483b38175621befedda1f1c',1,'cv::DftFlags'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf4dde112b483b38175621befedda1f1c',1,'DftFlags(Global Namespace)']]], + ['diag_394',['diag',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a024cc0510a4c61c7f266d4ab9fe13d7a',1,'cv::Mat::diag(int d=0) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a0f81856dbcb93eae6113947edb3ea068',1,'cv::Mat::diag(const Mat &d)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aee2330167702fd15a0b1c038b63a6198',1,'cv::Mat_::diag()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aee2330167702fd15a0b1c038b63a6198',1,'Mat_< double >::diag()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aee2330167702fd15a0b1c038b63a6198',1,'Mat_< float >::diag()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aee2330167702fd15a0b1c038b63a6198',1,'Mat_< uchar >::diag()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aee2330167702fd15a0b1c038b63a6198',1,'Mat_< unsigned char >::diag()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a1ca4c30675b372904812b6ca389b0fc0',1,'cv::MatExpr::diag()'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a45f7b6420807bae20997866f8a6ab31d',1,'cv::MatOp::diag()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'cv::Matx::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'cv::Matx::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< _Tp, cn, 1 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< _Tp, cn, 1 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, 1, 3 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, 1, 3 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, 2, 2 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, 2, 2 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, 2, 3 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, 2, 3 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, 3, 3 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, 3, 3 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, 3, 4 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, 3, 4 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, 4, 4 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, 4, 4 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< double, cn, 1 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< double, cn, 1 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< float, 2, 3 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< float, 2, 3 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< float, 3, 3 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< float, 3, 3 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< float, cn, 1 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< float, cn, 1 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aae3606f80ef046e79628cd8b5fc54fb8',1,'Matx< float_type, 4, 4 >::diag() const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a66d1c97702e18608ef7279a70cffa4cf',1,'Matx< float_type, 4, 4 >::diag(const diag_type &d)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a4bac5184c68677463a435e2bee4a8ac7',1,'cv::UMat::diag(int d=0) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a0da02ad901084904580cf4b39d1552e9',1,'cv::UMat::diag(const UMat &d)']]], + ['diag_5ftype_395',['diag_type',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'cv::Matx::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< _Tp, cn, 1 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, 1, 3 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, 2, 2 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, 2, 3 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, 3, 3 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, 3, 4 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, 4, 4 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< double, cn, 1 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< float, 2, 3 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< float, 3, 3 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< float, cn, 1 >::diag_type'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6ecf9ed18e29806025b5febbabcbeb9b',1,'Matx< float_type, 4, 4 >::diag_type']]], + ['diagnostics_396',['Diagnostics',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01473.html',1,'']]], + ['diagonal_397',['Diagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1Diagonal.html',1,'Eigen']]], + ['diagonal_398',['diagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a92fbafe85f1c941ed0b4c92711e8db56',1,'Eigen::AlignedBox::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a49c751bd59187979e1406b18e3b16049',1,'Eigen::DiagonalMatrix::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a71b770614009e5af4b63d5f8005af2a5',1,'Eigen::DiagonalMatrix::diagonal() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalWrapper.html#afd4146738d335e1ce99cffde198f1f31',1,'Eigen::DiagonalWrapper::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a63882a46e6f35b432d427f280f7a18e5',1,'Eigen::MatrixBase::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a13d4b8efbd7797ee8efd3dd988a7f7',1,'Eigen::MatrixBase::diagonal(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aed11a711c0a3d5dbf8bc094008e29846',1,'Eigen::MatrixBase::diagonal(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a63882a46e6f35b432d427f280f7a18e5',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a13d4b8efbd7797ee8efd3dd988a7f7',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::diagonal(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aed11a711c0a3d5dbf8bc094008e29846',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::diagonal(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a63882a46e6f35b432d427f280f7a18e5',1,'MatrixBase< Solve< Decomposition, RhsType > >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a13d4b8efbd7797ee8efd3dd988a7f7',1,'MatrixBase< Solve< Decomposition, RhsType > >::diagonal(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aed11a711c0a3d5dbf8bc094008e29846',1,'MatrixBase< Solve< Decomposition, RhsType > >::diagonal(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a9fcc7108054ac4a3b0ef758c794c16a7',1,'Eigen::SelfAdjointView::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a9fcc7108054ac4a3b0ef758c794c16a7',1,'SelfAdjointView< const Derived, UpLo >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af83005640c2771ebd69f98848720ee52',1,'Eigen::SparseMatrix::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4423486f9fd64cbac7be06c748b37e0a',1,'Eigen::SparseMatrix::diagonal() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af83005640c2771ebd69f98848720ee52',1,'SparseMatrix< Scalar >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4423486f9fd64cbac7be06c748b37e0a',1,'SparseMatrix< Scalar >::diagonal() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af83005640c2771ebd69f98848720ee52',1,'SparseMatrix< Scalar, ColMajor, int >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4423486f9fd64cbac7be06c748b37e0a',1,'SparseMatrix< Scalar, ColMajor, int >::diagonal() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af83005640c2771ebd69f98848720ee52',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4423486f9fd64cbac7be06c748b37e0a',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::diagonal() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af83005640c2771ebd69f98848720ee52',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::diagonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4423486f9fd64cbac7be06c748b37e0a',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::diagonal() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a0b7ff4860aa6f7c0761b1059c012fd8e',1,'Eigen::Tridiagonalization::diagonal()']]], + ['diagonal_3c_20const_20derived_2c_20index_20_3e_399',['Diagonal< const Derived, Index >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Diagonal.html',1,'']]], + ['diagonalmatrix_400',['DiagonalMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html',1,'Eigen::DiagonalMatrix< class, SizeAtCompileTime, MaxSizeAtCompileTime >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a07deda6348ef81a6a07577c40e5a8687',1,'Eigen::DiagonalMatrix::DiagonalMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a41b3d77b1ce65062a9ab53073083bac8',1,'Eigen::DiagonalMatrix::DiagonalMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a09701a17fa9ead2145174b4f4db6ab67',1,'Eigen::DiagonalMatrix::DiagonalMatrix(const MatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a7733cedccd7422367a5face3a80cf825',1,'Eigen::DiagonalMatrix::DiagonalMatrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a8d674e5eaa4c378d5a3f96a9007ca349',1,'Eigen::DiagonalMatrix::DiagonalMatrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a09d6cb930dff5e147ce22e08f2bb74b5',1,'Eigen::DiagonalMatrix::DiagonalMatrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#ac02390a9988bc1e7e54e133ba68bacee',1,'Eigen::DiagonalMatrix::DiagonalMatrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#ab069e106761d66fe1c2c494e7daf2244',1,'Eigen::DiagonalMatrix::DiagonalMatrix(Index dim)']]], + ['diagonalpreconditioner_401',['DiagonalPreconditioner',['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalPreconditioner.html',1,'Eigen']]], + ['diagonalsize_402',['diagonalSize',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab79e511b9322b8b801858e253fb257eb',1,'Eigen::MatrixBase::diagonalSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab79e511b9322b8b801858e253fb257eb',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::diagonalSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab79e511b9322b8b801858e253fb257eb',1,'MatrixBase< Solve< Decomposition, RhsType > >::diagonalSize()']]], + ['diagonalwrapper_403',['DiagonalWrapper',['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalWrapper.html',1,'Eigen::DiagonalWrapper< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalWrapper.html#af71ac89792969bdd7f2661fa6d4159a0',1,'Eigen::DiagonalWrapper::DiagonalWrapper()']]], + ['diamond_20markers_404',['Detection of Diamond Markers',['https://docs.opencv.org/4.2.0/d5/d07/tutorial_charuco_diamond_detection.html',1,'']]], + ['dict_405',['Dict',['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html',1,'cv::dnn']]], + ['dict_2ehpp_406',['dict.hpp',['https://docs.opencv.org/4.2.0/df/de6/dict_8hpp.html',1,'']]], + ['dict_5f4x4_5f100_407',['DICT_4X4_100',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6df6c3ad38ac44ea1546ef4f4841f310',1,'cv::aruco::DICT_4X4_100'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6df6c3ad38ac44ea1546ef4f4841f310',1,'DICT_4X4_100(Global Namespace)']]], + ['dict_5f4x4_5f1000_408',['DICT_4X4_1000',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a395a8309569c1977538fd11b57752087',1,'cv::aruco::DICT_4X4_1000'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a395a8309569c1977538fd11b57752087',1,'DICT_4X4_1000(Global Namespace)']]], + ['dict_5f4x4_5f250_409',['DICT_4X4_250',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ab76bdd5591c56a72b4359f7e34b0d681',1,'cv::aruco::DICT_4X4_250'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ab76bdd5591c56a72b4359f7e34b0d681',1,'DICT_4X4_250(Global Namespace)']]], + ['dict_5f4x4_5f50_410',['DICT_4X4_50',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ada8e830ff0024e839e93c01f5fed0c55',1,'cv::aruco::DICT_4X4_50'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ada8e830ff0024e839e93c01f5fed0c55',1,'DICT_4X4_50(Global Namespace)']]], + ['dict_5f5x5_5f100_411',['DICT_5X5_100',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a85cd9c2830621caeeda490d059bc2743',1,'cv::aruco::DICT_5X5_100'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a85cd9c2830621caeeda490d059bc2743',1,'DICT_5X5_100(Global Namespace)']]], + ['dict_5f5x5_5f1000_412',['DICT_5X5_1000',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a74a4638c42518ef99248639169b4f96b',1,'cv::aruco::DICT_5X5_1000'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a74a4638c42518ef99248639169b4f96b',1,'DICT_5X5_1000(Global Namespace)']]], + ['dict_5f5x5_5f250_413',['DICT_5X5_250',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975aeef63448bb93975855db174da8d4e008',1,'cv::aruco::DICT_5X5_250'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975aeef63448bb93975855db174da8d4e008',1,'DICT_5X5_250(Global Namespace)']]], + ['dict_5f5x5_5f50_414',['DICT_5X5_50',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a37f2f428fbac13d12e90c47e8c6fc8d1',1,'cv::aruco::DICT_5X5_50'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a37f2f428fbac13d12e90c47e8c6fc8d1',1,'DICT_5X5_50(Global Namespace)']]], + ['dict_5f6x6_5f100_415',['DICT_6X6_100',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a033f9561c7bd604f70912ecb9a49fee2',1,'cv::aruco::DICT_6X6_100'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a033f9561c7bd604f70912ecb9a49fee2',1,'DICT_6X6_100(Global Namespace)']]], + ['dict_5f6x6_5f1000_416',['DICT_6X6_1000',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a9f3ab829fb35fc9ff30e8f809d318e03',1,'cv::aruco::DICT_6X6_1000'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a9f3ab829fb35fc9ff30e8f809d318e03',1,'DICT_6X6_1000(Global Namespace)']]], + ['dict_5f6x6_5f250_417',['DICT_6X6_250',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6eb1a3e9c94c7123d8b1904a57193f16',1,'cv::aruco::DICT_6X6_250'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6eb1a3e9c94c7123d8b1904a57193f16',1,'DICT_6X6_250(Global Namespace)']]], + ['dict_5f6x6_5f50_418',['DICT_6X6_50',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ad5b25a02c860debd3cba97975b90cc1e',1,'cv::aruco::DICT_6X6_50'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ad5b25a02c860debd3cba97975b90cc1e',1,'DICT_6X6_50(Global Namespace)']]], + ['dict_5f7x7_5f100_419',['DICT_7X7_100',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a5a3270f81a64936b79e8e9712187b85d',1,'cv::aruco::DICT_7X7_100'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a5a3270f81a64936b79e8e9712187b85d',1,'DICT_7X7_100(Global Namespace)']]], + ['dict_5f7x7_5f1000_420',['DICT_7X7_1000',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a91dc783a8d4adc55a8ff8b48212a1c27',1,'cv::aruco::DICT_7X7_1000'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a91dc783a8d4adc55a8ff8b48212a1c27',1,'DICT_7X7_1000(Global Namespace)']]], + ['dict_5f7x7_5f250_421',['DICT_7X7_250',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a69192aa267e8624d8a886d8a875fcfa6',1,'cv::aruco::DICT_7X7_250'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a69192aa267e8624d8a886d8a875fcfa6',1,'DICT_7X7_250(Global Namespace)']]], + ['dict_5f7x7_5f50_422',['DICT_7X7_50',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a7c9044100bd1cc60d41473c4cd9cb683',1,'cv::aruco::DICT_7X7_50'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a7c9044100bd1cc60d41473c4cd9cb683',1,'DICT_7X7_50(Global Namespace)']]], + ['dict_5fapriltag_5f16h5_423',['DICT_APRILTAG_16h5',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6235dfb8007de53d3e8de11bee1e3854',1,'cv::aruco::DICT_APRILTAG_16h5'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6235dfb8007de53d3e8de11bee1e3854',1,'DICT_APRILTAG_16h5(Global Namespace)']]], + ['dict_5fapriltag_5f25h9_424',['DICT_APRILTAG_25h9',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a52c8d2fe982b65dda93dd70e3d18be30',1,'cv::aruco::DICT_APRILTAG_25h9'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a52c8d2fe982b65dda93dd70e3d18be30',1,'DICT_APRILTAG_25h9(Global Namespace)']]], + ['dict_5fapriltag_5f36h10_425',['DICT_APRILTAG_36h10',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ad2f28bef0b2b725e592bce9cd34183e9',1,'cv::aruco::DICT_APRILTAG_36h10'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975ad2f28bef0b2b725e592bce9cd34183e9',1,'DICT_APRILTAG_36h10(Global Namespace)']]], + ['dict_5fapriltag_5f36h11_426',['DICT_APRILTAG_36h11',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a8e9e65926cdf4898a760b3dfd9daf989',1,'cv::aruco::DICT_APRILTAG_36h11'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a8e9e65926cdf4898a760b3dfd9daf989',1,'DICT_APRILTAG_36h11(Global Namespace)']]], + ['dict_5faruco_5foriginal_427',['DICT_ARUCO_ORIGINAL',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6c2a6d747864ef4daad8cdeffa07f7c0',1,'cv::aruco::DICT_ARUCO_ORIGINAL'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ggac84398a9ed9dd01306592dd616c2c975a6c2a6d747864ef4daad8cdeffa07f7c0',1,'DICT_ARUCO_ORIGINAL(Global Namespace)']]], + ['dictionary_428',['Dictionary',['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html',1,'cv::aruco::Dictionary'],['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a3954d49cd3dd1c9caf76b7951a1613fa',1,'cv::aruco::Dictionary::Dictionary(const Mat &_bytesList=Mat(), int _markerSize=0, int _maxcorr=0)'],['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#af17873363bfce8647d6b061c4e3d2245',1,'cv::aruco::Dictionary::Dictionary(const Ptr< Dictionary > &_dictionary)']]], + ['dictionary_429',['dictionary',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1aruco_1_1Board.html#a733dd520d8e00312200aadab83c66672',1,'cv::aruco::Board']]], + ['dictionary_2ehpp_430',['dictionary.hpp',['https://docs.opencv.org/4.2.0/dc/df7/dictionary_8hpp.html',1,'']]], + ['dictvalue_431',['DictValue',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html',1,'cv::dnn::DictValue'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a698b06bee20e36ba4958958671dd63f2',1,'cv::dnn::DictValue::DictValue(const DictValue &r)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a4f6f8525de9b300853993e40412191b8',1,'cv::dnn::DictValue::DictValue(bool i)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a6fee3f7959b90147181f839c6730ef83',1,'cv::dnn::DictValue::DictValue(int64 i=0)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a1cf0e958da115e684b22bb556a31ac12',1,'cv::dnn::DictValue::DictValue(int i)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#ad9ea1880c9305e3c86fbb2b9c230b212',1,'cv::dnn::DictValue::DictValue(unsigned p)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a201c45dcb3b2953a5771c9198e9a5a50',1,'cv::dnn::DictValue::DictValue(double p)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#add3c5d6732209156e725baabb5cf41c8',1,'cv::dnn::DictValue::DictValue(const String &s)'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a6a65b943e5dc77120103b6b4efdd065a',1,'cv::dnn::DictValue::DictValue(const char *s)']]], + ['diff_432',['diff',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a1c1f21327df91a4dd6c5f5a107240385.html#a1c1f21327df91a4dd6c5f5a107240385',1,'nlohmann::basic_json::diff()'],['../classrobot_1_1types_1_1LimitSwitchData.html#a00f300a3253cff50c47a4054d485fcab',1,'robot::types::LimitSwitchData::diff()']]], + ['diff_5fcharbonnier_433',['DIFF_CHARBONNIER',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a95fa590c085aad08adca9e2d962bad3da94ad3fbf098e9b7f9fb6a5a754067967',1,'cv::KAZE']]], + ['diff_5fpm_5fg1_434',['DIFF_PM_G1',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a95fa590c085aad08adca9e2d962bad3dad6659572d4c1e28eac8f2457c659dd8c',1,'cv::KAZE']]], + ['diff_5fpm_5fg2_435',['DIFF_PM_G2',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a95fa590c085aad08adca9e2d962bad3daf0bf57c733e7cf3d4f465523e9c058d1',1,'cv::KAZE']]], + ['diff_5fweickert_436',['DIFF_WEICKERT',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a95fa590c085aad08adca9e2d962bad3da447463a563f9ac8e641dca67e4cda08b',1,'cv::KAZE']]], + ['diffdrivekinematics_437',['DiffDriveKinematics',['../classkinematics_1_1DiffDriveKinematics.html',1,'kinematics::DiffDriveKinematics'],['../classkinematics_1_1DiffDriveKinematics.html#aa7ed30b4de6cb335e3ca2e2a66a73247',1,'kinematics::DiffDriveKinematics::DiffDriveKinematics()']]], + ['difference_438',['Element-wise absolute difference',['https://docs.opencv.org/4.2.0/d5/dec/group__core__hal__interface__absdiff.html',1,'']]], + ['difference_5fthreshold_439',['difference_threshold',['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a918778bf0ba6419ed272c8b2b7739baf',1,'cv::linemod::DepthNormal']]], + ['difference_5ftype_440',['difference_type',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a2b21e4c026b5a64f53b1eea298b89735',1,'cv::Allocator::difference_type'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ae11eaf393d7a95387aa2f5298a296fb6',1,'cv::MatConstIterator::difference_type'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#afd6e21498919734f64f2957e87485a7e',1,'cv::MatConstIterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a60ca6e16f3a71fde157c1376d14afc62',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a60ca6e16f3a71fde157c1376d14afc62',1,'__gnu_pbds::detail::bin_search_tree_node_it_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#a74b080229c28726dcc2bf12ce54cfefe',1,'__gnu_pbds::detail::binary_heap_const_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#afa0007845d620ae7f329c9813ecfe7d0',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#a7a99e74779506a128cd9557bcdb62294',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a616b40631335033152a105b5f70abd0a',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a653e076069bf6f57a6b09ca015d56a4e',1,'allocator_traits< _Tp_alloc_type >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#a5aa0e868f0386bf8136500e986ccdbdd',1,'const_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< input_iterator_tag, _CharT, _Traits::off_type, _CharT *, _CharT >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< input_iterator_tag, _Tp, _Dist, const _Tp *, const _Tp & >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< iterator_traits< _Iterator >::iterator_category, iterator_traits< _Iterator >::value_type, iterator_traits< _Iterator >::difference_type, iterator_traits< _Iterator >::pointer, iterator_traits< _Iterator >::reference >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< output_iterator_tag, void, void, void, void >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< std::output_iterator_tag, void, void, void, void >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< std::random_access_iterator_tag, _CharT >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'iterator< std::random_access_iterator_tag, bool >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a8fcb57cdcee0a5668a3aae97bc159ff6',1,'iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#af7235d3d4813ccc8f644d3f099691c3a',1,'point_const_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#add99e941f5a6608fd1944d01db299168',1,'point_iterator_::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a653e076069bf6f57a6b09ca015d56a4e',1,'std::allocator_traits::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a882b662be1b1300acf04490112ae63f3',1,'std::allocator_traits< allocator< _Tp > >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::back_insert_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::front_insert_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::insert_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::istream_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::istreambuf_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::ostream_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::ostreambuf_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06311.html#aae92f86267e7a5f41c435f4f28eecbdb',1,'std::pointer_traits::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06323.html#a795f872c4242cf5a82add01ec8a295ed',1,'std::pointer_traits< _Tp * >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07711.html#a7fc5091a6bee76d7bfc6ece04e4050f9',1,'std::raw_storage_iterator::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a1209ccfa7ee8ec775e03282e07a4d3ab',1,'std::set::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a1209ccfa7ee8ec775e03282e07a4d3ab',1,'std::set::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aede8ad7332db3b16e68cec19c0dd963e',1,'std::unordered_map::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aede8ad7332db3b16e68cec19c0dd963e',1,'std::unordered_map::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ab91e542e87512944adfb13fcff51d7c8',1,'std::unordered_multimap::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ab91e542e87512944adfb13fcff51d7c8',1,'std::unordered_multimap::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0dfc41e4c0a1ec68c0e4ee0fba4783ee',1,'std::unordered_multiset::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a0dfc41e4c0a1ec68c0e4ee0fba4783ee',1,'std::unordered_multiset::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a78081fffb25f4c7c28a59c7cf4218c51',1,'std::unordered_set::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a78081fffb25f4c7c28a59c7cf4218c51',1,'std::unordered_set::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aede8ad7332db3b16e68cec19c0dd963e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::difference_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aede8ad7332db3b16e68cec19c0dd963e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::difference_type'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3d20d11e5dfe95084a76f62eca54fadd.html#a3d20d11e5dfe95084a76f62eca54fadd',1,'nlohmann::basic_json::difference_type']]], + ['different_20datasets_441',['Framework for working with different datasets',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html',1,'']]], + ['different_20image_20hashing_20algorithms_442',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], + ['difficult_443',['difficult',['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#ae663f41a5cb817c5e53ce03a5927f783',1,'cv::datasets::PascalObj']]], + ['diffusivitytype_444',['DiffusivityType',['https://docs.opencv.org/4.2.0/d3/d61/classcv_1_1KAZE.html#a95fa590c085aad08adca9e2d962bad3d',1,'cv::KAZE']]], + ['diffwristkinematics_445',['DiffWristKinematics',['../classkinematics_1_1DiffWristKinematics.html',1,'kinematics']]], + ['digamma_446',['digamma',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af40db84b3db19fe25fe2f77c429420e5',1,'Eigen']]], + ['digits_447',['digits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a6e3cb3ba2f8a6742d4759b989e5e3fed',1,'std::__numeric_limits_base::digits'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#a6e3cb3ba2f8a6742d4759b989e5e3fed',1,'std::numeric_limits::digits']]], + ['digits10_448',['digits10',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#acc2df72b67282d8ad4ca54cbb4826475',1,'std::__numeric_limits_base::digits10'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02515.html#acc2df72b67282d8ad4ca54cbb4826475',1,'std::numeric_limits::digits10']]], + ['dilate_449',['dilate',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga4ff0f3318642c4f469d0e11f242f3b6c',1,'cv::dilate()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga2bbdb0560707a4d2b0b0e3c4bdf41975',1,'cv::gapi::dilate()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#gac3de990089892266fa30189edcb6da3c',1,'cv::ximgproc::rl::dilate()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga4ff0f3318642c4f469d0e11f242f3b6c',1,'dilate(InputArray src, OutputArray dst, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga2bbdb0560707a4d2b0b0e3c4bdf41975',1,'dilate(const GMat &src, const Mat &kernel, const Point &anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#gac3de990089892266fa30189edcb6da3c',1,'dilate(InputArray rlSrc, OutputArray rlDest, InputArray rlKernel, Point anchor=Point(0, 0))(Global Namespace)']]], + ['dilate3x3_450',['dilate3x3',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gafa1c08d3a18264ca3089ec843658108b',1,'cv::gapi::dilate3x3()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gafa1c08d3a18264ca3089ec843658108b',1,'dilate3x3(const GMat &src, int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)']]], + ['dilating_451',['Eroding and Dilating',['https://docs.opencv.org/4.2.0/db/df6/tutorial_erosion_dilatation.html',1,'']]], + ['dilation_452',['dilation',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html#a7fec6cdaed8a7ebadf4d424ff2c0797d',1,'cv::dnn::BaseConvolutionLayer']]], + ['dilations_453',['dilations',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html#a544fe2da6b63670d107c3273b7caec1c',1,'cv::dnn::BaseConvolutionLayer']]], + ['dim_454',['dim',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a5301115f222e591b38cc1ebed36856e1',1,'Eigen::AlignedBox::dim()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#a23de6500e87586f5ca9904fe5315b51d',1,'Eigen::Hyperplane::dim()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a68d562318c269edaa8ecb7aca98706d4',1,'Eigen::ParametrizedLine::dim()']]], + ['dimensional_20phase_20maps_455',['Unwrap two-dimensional phase maps',['https://docs.opencv.org/4.2.0/d9/dfb/tutorial_unwrap.html',1,'']]], + ['dimensional_20spaces_456',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], + ['dimensionofkernel_457',['dimensionOfKernel',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a7c9294565d179226133770160b827be1',1,'Eigen::ColPivHouseholderQR::dimensionOfKernel()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a7c9294565d179226133770160b827be1',1,'ColPivHouseholderQR< MatrixType >::dimensionOfKernel()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#aca2b59560c4851b7d7701872990a3426',1,'Eigen::CompleteOrthogonalDecomposition::dimensionOfKernel()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a3b5fe5edc66acc01c45b16e728470aa0',1,'Eigen::FullPivHouseholderQR::dimensionOfKernel()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a64e191225834e91161ea53ad4b78167b',1,'Eigen::FullPivLU::dimensionOfKernel()']]], + ['dimode_458',['DIMode',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a88ac0672287263232bbd0f3fb1af6005',1,'cv::cudacodec::EncoderParams']]], + ['dims_459',['dims',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#aed459b7df39d58b591153e84f0139cca',1,'cv::GMatDesc::dims'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#ad474662d46f4a5cfa6fa9c561e3877b6',1,'cv::SparseMat::Hdr::dims'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a39cf614aa52567e9a945cd2609bd767b',1,'cv::Mat::dims'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a2c377f13c5449f811cc995df017afa35',1,'cv::gapi::own::detail::MatHeader::dims'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a7ad5753f30745d97f4e037516f3edf4f',1,'cv::UMat::dims'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a925e432f82689ff04dcc7d7576a735a8',1,'cv::_InputArray::dims()'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a5e7cfd2e21867c010f973db8c915bfaa',1,'cv::MatSize::dims()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a1779da985ecb9cd570e0dd71a49b6aca',1,'cv::SparseMat::dims()']]], + ['direct_5fbases_460',['direct_bases',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09819.html',1,'std::tr2']]], + ['direct_5fmask_5frange_5fhashing_461',['direct_mask_range_hashing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11151.html',1,'__gnu_pbds']]], + ['direct_5fmask_5frange_5fhashing_5fimp_2ehpp_462',['direct_mask_range_hashing_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01310.html',1,'']]], + ['direct_5fmod_5frange_5fhashing_463',['direct_mod_range_hashing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11155.html',1,'__gnu_pbds']]], + ['direct_5fmod_5frange_5fhashing_5fimp_2ehpp_464',['direct_mod_range_hashing_imp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01313.html',1,'']]], + ['directaccessbit_465',['DirectAccessBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gabf1e9d0516a933445a4c307ad8f14915',1,'Eigen::DirectAccessBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gabf1e9d0516a933445a4c307ad8f14915',1,'DirectAccessBit(Global Namespace)']]], + ['directaccessors_466',['DirectAccessors',['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5da50108ad00095928de06228470ceab09e',1,'Eigen::DirectAccessors'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5da50108ad00095928de06228470ceab09e',1,'DirectAccessors(Global Namespace)']]], + ['direction_5ffunc_467',['direction_func',['https://docs.opencv.org/4.2.0/d3/d97/structcv_1_1cudev_1_1direction__func.html',1,'cv::cudev']]], + ['directiontype_468',['DirectionType',['https://eigen.tuxfamily.org/dox/group__enums.html#gad49a7b3738e273eb00932271b36127f7',1,'Eigen::DirectionType'],['https://eigen.tuxfamily.org/dox/group__enums.html#gad49a7b3738e273eb00932271b36127f7',1,'DirectionType(Global Namespace)']]], + ['directives_469',['Preprocessor directives',['https://eigen.tuxfamily.org/dox/TopicPreprocessorDirectives.html',1,'']]], + ['directories_5fonly_470',['directories_only',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a1f52cf0f9500bc623b7e67d3b3eb5a61',1,'directories_only(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html#ga67e62e740e17772bdd02c16c494f8298a1f52cf0f9500bc623b7e67d3b3eb5a61',1,'directories_only(Global Namespace)']]], + ['directwriteaccessors_471',['DirectWriteAccessors',['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5dacbe59d09ba2fdf8eac127bff1a1f0234',1,'Eigen::DirectWriteAccessors'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga9f93eac38eb83deb0e8dbd42ddf11d5dacbe59d09ba2fdf8eac127bff1a1f0234',1,'DirectWriteAccessors(Global Namespace)']]], + ['directx_20interoperability_472',['DirectX interoperability',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html',1,'']]], + ['directx_2ehpp_473',['directx.hpp',['https://docs.opencv.org/4.2.0/df/d8b/directx_8hpp.html',1,'']]], + ['disable_5ftiming_474',['DISABLE_TIMING',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa912544338415c5f8c8e55e85a139bfba4f52a0e153b5d1ae7eab089d8eb9c379',1,'cv::cuda::Event']]], + ['disablecabac_475',['DisableCabac',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a504aa47d788878810ee89524de78c4d3',1,'cv::cudacodec::EncoderParams']]], + ['disableif_476',['DisableIf',['https://docs.opencv.org/4.2.0/df/d27/structcv_1_1cudev_1_1DisableIf.html',1,'cv::cudev']]], + ['disablespspps_477',['DisableSPSPPS',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a3a5b9827c1625522ff80a5f4cddd61cc',1,'cv::cudacodec::EncoderParams']]], + ['discard_478',['discard',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a5e2f7304fcf0b11ea1cde1397fb7ddb6',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::discard()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a34ad0ea19451ee1c087351414947c190',1,'std::discard_block_engine::discard()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a80e7c314ddc6fd4cf54a5f720e89801a',1,'std::independent_bits_engine::discard()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a6c3917727c95e3e73ea25871ebd21441',1,'std::linear_congruential_engine::discard()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a5e2f7304fcf0b11ea1cde1397fb7ddb6',1,'std::mersenne_twister_engine::discard()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#ad057867e94320322ce2b19478b942244',1,'std::shuffle_order_engine::discard()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a76b226f563a8fb3eeb3c48999b3e9bc4',1,'std::subtract_with_carry_engine::discard()']]], + ['discard_5fblock_5fengine_479',['discard_block_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html',1,'std::discard_block_engine< _RandomNumberEngine, __p, __r >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#aa4197a4ae6f9057e0473bdea26087a42',1,'std::discard_block_engine::discard_block_engine()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a2fbd9faf2b21da3be4d307608020e93c',1,'std::discard_block_engine::discard_block_engine(const _RandomNumberEngine &__rng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a5b10975e19ab0b41895b72b59acb3f47',1,'std::discard_block_engine::discard_block_engine(_RandomNumberEngine &&__rng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#af23cfe2cdaf2fd6146ac3f99806d64f0',1,'std::discard_block_engine::discard_block_engine(result_type __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#ab4c425df46f55cbd80745d0ebaf8cacd',1,'std::discard_block_engine::discard_block_engine(_Sseq &__q)']]], + ['discovering_20the_20human_20retina_20and_20its_20use_20for_20image_20processing_480',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], + ['discrete_481',['DISCRETE',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a22a5db4ceb750ca68782ddb32f44562fab727f32adfac249a79ad471e3bc34fb9',1,'cv::ml::Boost']]], + ['discrete_20fourier_20transform_482',['Discrete Fourier Transform',['https://docs.opencv.org/4.2.0/d8/d01/tutorial_discrete_fourier_transform.html',1,'']]], + ['discrete_5fdistribution_483',['discrete_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html',1,'std']]], + ['discrete_5ffourier_5ftransform_2emarkdown_484',['discrete_fourier_transform.markdown',['https://docs.opencv.org/4.2.0/d7/d0e/discrete__fourier__transform_8markdown.html',1,'']]], + ['discretetocontinuous_485',['discreteToContinuous',['../namespacefilters_1_1statespace.html#a026831d15dda3bcbcc28ffeb8f3f3868',1,'filters::statespace::discreteToContinuous(const Eigen::Matrix< double, numStates, numStates > &A, double dt)'],['../namespacefilters_1_1statespace.html#aa430ea42801bc68abef9be59bf40660a',1,'filters::statespace::discreteToContinuous(Eigen::Matrix< double, numStates, numStates > &A, Eigen::Matrix< double, numStates, numInputs > &B, double dt)']]], + ['discretizea_486',['discretizeA',['../namespacefilters_1_1statespace.html#af262c3b65a5cdba914383868b5b1209e',1,'filters::statespace']]], + ['discretizeaq_487',['discretizeAQ',['../namespacefilters_1_1statespace.html#a25eab8e5d6708f3c6720ae13419b1b1c',1,'filters::statespace']]], + ['discretizeq_488',['discretizeQ',['../namespacefilters_1_1statespace.html#a23a8eb2072edcfbb6c13c88ee6bdd3f5',1,'filters::statespace']]], + ['discretizer_489',['discretizeR',['../namespacefilters_1_1statespace.html#af5e196af46e2bd76ca8ad928e583a314',1,'filters::statespace']]], + ['disjointsets_490',['DisjointSets',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html',1,'cv::detail::DisjointSets'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#ab0c7e73d1acaaa2b48a1df5066b569de',1,'cv::detail::DisjointSets::DisjointSets()']]], + ['disopticalflow_491',['DISOpticalFlow',['https://docs.opencv.org/4.2.0/de/d4f/classcv_1_1DISOpticalFlow.html',1,'cv']]], + ['disp_5fscale_492',['DISP_SCALE',['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#a5dc5659c145e9bbcf6c6209a02f6f098a5b4b128a781d8002c3bc2640912295a4',1,'cv::StereoMatcher::DISP_SCALE'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#a2ce6f411e4012e1d72f6287c55168eaba55f813e92db6e70696202c12d1f38e84',1,'cv::stereo::StereoMatcher::DISP_SCALE']]], + ['disp_5fshift_493',['DISP_SHIFT',['https://docs.opencv.org/4.2.0/d2/d6e/classcv_1_1StereoMatcher.html#a5dc5659c145e9bbcf6c6209a02f6f098a6aadf3b0bd4503bde2531592e5f90e0b',1,'cv::StereoMatcher::DISP_SHIFT'],['https://docs.opencv.org/4.2.0/d9/d07/classcv_1_1stereo_1_1StereoMatcher.html#a2ce6f411e4012e1d72f6287c55168eaba51b0bc809c0414dc2704e75395e3bfef',1,'cv::stereo::StereoMatcher::DISP_SHIFT']]], + ['disparity_20map_20post_20filtering_494',['Disparity map post-filtering',['https://docs.opencv.org/4.2.0/d3/d14/tutorial_ximgproc_disparity_filtering.html',1,'']]], + ['disparity_5ffilter_2ehpp_495',['disparity_filter.hpp',['https://docs.opencv.org/4.2.0/da/d08/disparity__filter_8hpp.html',1,'']]], + ['disparity_5ffiltering_2emarkdown_496',['disparity_filtering.markdown',['https://docs.opencv.org/4.2.0/d1/de3/disparity__filtering_8markdown.html',1,'']]], + ['disparitybilateralfilter_497',['DisparityBilateralFilter',['https://docs.opencv.org/4.2.0/d8/d4f/classcv_1_1cuda_1_1DisparityBilateralFilter.html',1,'cv::cuda']]], + ['disparityfilter_498',['DisparityFilter',['https://docs.opencv.org/4.2.0/db/d72/classcv_1_1ximgproc_1_1DisparityFilter.html',1,'cv::ximgproc']]], + ['disparitygradient_499',['disparityGradient',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga6018bf3e2a2ed2a3335ba25ccbcddf66',1,'cv::stereo::PropagationParameters::disparityGradient'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga6018bf3e2a2ed2a3335ba25ccbcddf66',1,'disparityGradient(Global Namespace)']]], + ['disparitywlsfilter_500',['DisparityWLSFilter',['https://docs.opencv.org/4.2.0/d9/d51/classcv_1_1ximgproc_1_1DisparityWLSFilter.html',1,'cv::ximgproc']]], + ['dispartymapformation_501',['dispartyMapFormation',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a34810b40a55e57384cd45b31a25069ed',1,'cv::stereo::Matching']]], + ['display_20an_20image_502',['Load and Display an Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'']]], + ['display_5fimage_2emarkdown_503',['display_image.markdown',['https://docs.opencv.org/4.2.0/dd/d8a/display__image_8markdown.html',1,'']]], + ['displayoverlay_504',['displayOverlay',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga704e0387318cd1e7928e6fe17e81d6aa',1,'cv::displayOverlay()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga704e0387318cd1e7928e6fe17e81d6aa',1,'displayOverlay()(Global Namespace)']]], + ['displaystatusbar_505',['displayStatusBar',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gac56ae86269eb4fbd9c8d8cb7babfbf64',1,'cv::displayStatusBar()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gac56ae86269eb4fbd9c8d8cb7babfbf64',1,'displayStatusBar(const String &winname, const String &text, int delayms=0)(Global Namespace)']]], + ['dist_2eh_506',['dist.h',['https://docs.opencv.org/4.2.0/d1/d82/dist_8h.html',1,'']]], + ['dist_5fc_507',['DIST_C',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8eba507b16eb5ef95ea784ca1b3cb7b0d7ee',1,'cv::DIST_C'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8eba507b16eb5ef95ea784ca1b3cb7b0d7ee',1,'DIST_C(Global Namespace)']]], + ['dist_5ffair_508',['DIST_FAIR',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaea158f5abd2b5e2b4e79b79f55297079',1,'cv::DIST_FAIR'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaea158f5abd2b5e2b4e79b79f55297079',1,'DIST_FAIR(Global Namespace)']]], + ['dist_5fhuber_509',['DIST_HUBER',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebad701f5622a12450d3b8c85c052e7c520',1,'cv::DIST_HUBER'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebad701f5622a12450d3b8c85c052e7c520',1,'DIST_HUBER(Global Namespace)']]], + ['dist_5fl1_510',['DIST_L1',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebae5b2dfaf2ba5024d7ce47885001fad86',1,'cv::DIST_L1'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebae5b2dfaf2ba5024d7ce47885001fad86',1,'DIST_L1(Global Namespace)']]], + ['dist_5fl12_511',['DIST_L12',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8eba8f3c18d37e99f7cc58d3605f5c6f9ce9',1,'cv::DIST_L12'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8eba8f3c18d37e99f7cc58d3605f5c6f9ce9',1,'DIST_L12(Global Namespace)']]], + ['dist_5fl2_512',['DIST_L2',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaff0d1f5be0fc152a56a9b9716d158b96',1,'cv::DIST_L2'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaff0d1f5be0fc152a56a9b9716d158b96',1,'DIST_L2(Global Namespace)']]], + ['dist_5flabel_5fccomp_513',['DIST_LABEL_CCOMP',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gga3fe343d63844c40318ee627bd1c1c42fa631de3e838ee72d6a9d991b8fbce4c1d',1,'cv::DIST_LABEL_CCOMP'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gga3fe343d63844c40318ee627bd1c1c42fa631de3e838ee72d6a9d991b8fbce4c1d',1,'DIST_LABEL_CCOMP(Global Namespace)']]], + ['dist_5flabel_5fpixel_514',['DIST_LABEL_PIXEL',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gga3fe343d63844c40318ee627bd1c1c42fa5d291835de98b72caa12a9947c2cd92a',1,'cv::DIST_LABEL_PIXEL'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gga3fe343d63844c40318ee627bd1c1c42fa5d291835de98b72caa12a9947c2cd92a',1,'DIST_LABEL_PIXEL(Global Namespace)']]], + ['dist_5fmask_5f3_515',['DIST_MASK_3',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaaa68392323ccf7fad87570e41259b497a520d4f90e1e37d13d7592fd295a6b5b2',1,'cv::DIST_MASK_3'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaaa68392323ccf7fad87570e41259b497a520d4f90e1e37d13d7592fd295a6b5b2',1,'DIST_MASK_3(Global Namespace)']]], + ['dist_5fmask_5f5_516',['DIST_MASK_5',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaaa68392323ccf7fad87570e41259b497a8a8b17ed6012f6ce42e56f302c07d481',1,'cv::DIST_MASK_5'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaaa68392323ccf7fad87570e41259b497a8a8b17ed6012f6ce42e56f302c07d481',1,'DIST_MASK_5(Global Namespace)']]], + ['dist_5fmask_5fprecise_517',['DIST_MASK_PRECISE',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaaa68392323ccf7fad87570e41259b497a71e13e06c1d12eabd2acd2669f94f9ca',1,'cv::DIST_MASK_PRECISE'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaaa68392323ccf7fad87570e41259b497a71e13e06c1d12eabd2acd2669f94f9ca',1,'DIST_MASK_PRECISE(Global Namespace)']]], + ['dist_5fuser_518',['DIST_USER',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaa0bb8d897ba16dbf5a3ca96c71219a32',1,'cv::DIST_USER'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaa0bb8d897ba16dbf5a3ca96c71219a32',1,'DIST_USER(Global Namespace)']]], + ['dist_5fwelsch_519',['DIST_WELSCH',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaba5e4b3600852b7a59e78e3041be840e',1,'cv::DIST_WELSCH'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa2bfbebbc5c320526897996aafa1d8ebaba5e4b3600852b7a59e78e3041be840e',1,'DIST_WELSCH(Global Namespace)']]], + ['distance_520',['Distance',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#ab36887c2b93d5152ad31f74de4301589',1,'cv::tbm::ITrackerByMatching']]], + ['distance_521',['distance',['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#a1cb9bee47b20ad96e16de28f4b9cbdf1',1,'cv::DMatch::distance'],['https://docs.opencv.org/4.2.0/d2/d5a/structcv_1_1face_1_1StandardCollector_1_1PredictResult.html#af8ca2c7dfa6b9658cff62e6bfa4c241b',1,'cv::face::StandardCollector::PredictResult::distance'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a25c3e5822420b850e92023cec644c0a0',1,'Eigen::ParametrizedLine::distance()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gade7ee057985825bd6d67e7a1a682dd89',1,'__gnu_cxx::distance()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a99b049793a96260d190d781f847038bc',1,'std::distance()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01468.html#gade7ee057985825bd6d67e7a1a682dd89',1,'distance(_InputIterator __first, _InputIterator __last, _Distance &__n)(Global Namespace)']]], + ['distance_20and_20matching_522',['Shape Distance and Matching',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html',1,'']]], + ['distance_20transform_20and_20watershed_20algorithm_523',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], + ['distance_5fstep_524',['distance_step',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#adc99cacce649ea3873e1fcd7899fdad3',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['distance_5fstep_5frelative_525',['distance_step_relative',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a41e7a6097f05bf724c9fccc771d228f2',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['distance_5fthreshold_526',['distance_threshold',['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#ac8e77f1630500b8921049bbce2908fca',1,'cv::linemod::DepthNormal']]], + ['distance_5ftransform_2emarkdown_527',['distance_transform.markdown',['https://docs.opencv.org/4.2.0/dc/d15/distance__transform_8markdown.html',1,'']]], + ['distancefast_528',['distanceFast',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#aac1f4b4dc7105d3d42e2dba3f084b398',1,'cv::tbm::ITrackerByMatching']]], + ['distancefunction_529',['DistanceFunction',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#afbfb1e721fa42ab53fe6cd733a51af9c',1,'cv::xfeatures2d::PCTSignatures']]], + ['distancemap_530',['distanceMap',['https://docs.opencv.org/4.2.0/d3/dea/classcv_1_1videostab_1_1FastMarchingMethod.html#af219b9d6ce2e079334a5308a8e66fb3a',1,'cv::videostab::FastMarchingMethod']]], + ['distancestrong_531',['distanceStrong',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#adb419543b0bd8129fd529ce71cbfaa92',1,'cv::tbm::ITrackerByMatching']]], + ['distancetransform_532',['distanceTransform',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga8a0b7fdfcb7a13dde018988ba3a43042',1,'cv::distanceTransform(InputArray src, OutputArray dst, OutputArray labels, int distanceType, int maskSize, int labelType=DIST_LABEL_CCOMP)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga25c259e7e2fa2ac70de4606ea800f12f',1,'cv::distanceTransform(InputArray src, OutputArray dst, int distanceType, int maskSize, int dstType=CV_32F)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga8a0b7fdfcb7a13dde018988ba3a43042',1,'distanceTransform(InputArray src, OutputArray dst, OutputArray labels, int distanceType, int maskSize, int labelType=DIST_LABEL_CCOMP)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga25c259e7e2fa2ac70de4606ea800f12f',1,'distanceTransform(InputArray src, OutputArray dst, int distanceType, int maskSize, int dstType=CV_32F)(Global Namespace)']]], + ['distancetransformlabeltypes_533',['DistanceTransformLabelTypes',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga3fe343d63844c40318ee627bd1c1c42f',1,'cv::DistanceTransformLabelTypes'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga3fe343d63844c40318ee627bd1c1c42f',1,'DistanceTransformLabelTypes(Global Namespace)']]], + ['distancetransformmasks_534',['DistanceTransformMasks',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaaa68392323ccf7fad87570e41259b497',1,'cv::DistanceTransformMasks'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaaa68392323ccf7fad87570e41259b497',1,'DistanceTransformMasks(Global Namespace)']]], + ['distancetype_535',['DistanceType',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1flann_1_1GenericIndex.html#a4b7623b6f2ebc7c1dc406460cd0cee02',1,'cv::flann::GenericIndex']]], + ['distancetypes_536',['DistanceTypes',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaa2bfbebbc5c320526897996aafa1d8eb',1,'cv::DistanceTypes'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaa2bfbebbc5c320526897996aafa1d8eb',1,'DistanceTypes(Global Namespace)']]], + ['distortion_5fmodel_537',['distortion_model',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a8f3fefa30cf9b26faf59da385028705a',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['distortpoints_538',['distortPoints',['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga75d8877a98e38d0b29b6892c5f8d7765',1,'cv::fisheye::distortPoints()'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga75d8877a98e38d0b29b6892c5f8d7765',1,'distortPoints(InputArray undistorted, OutputArray distorted, InputArray K, InputArray D, double alpha=0)(Global Namespace)']]], + ['distributions_539',['Distributions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html',1,'Bernoulli Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html',1,'Normal Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html',1,'Poisson Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01542.html',1,'Random Number Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html',1,'Uniform Distributions']]], + ['distthresh_540',['distThresh',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#a3eafeaddfc58cf879b1e64fe382108a9',1,'cv::videostab::MotionInpainter']]], + ['div_541',['div',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'cv::Matx::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< _Tp, cn, 1 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, 1, 3 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, 2, 2 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, 2, 3 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, 3, 3 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, 3, 4 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, 4, 4 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< double, cn, 1 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< float, 2, 3 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< float, 3, 3 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< float, cn, 1 >::div()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ac75fdbce4c1e5627b2729175bdb6eaf1',1,'Matx< float_type, 4, 4 >::div()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gac8d294174992b969881304c7035a5f9f',1,'cv::gapi::div()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gac8d294174992b969881304c7035a5f9f',1,'div()(Global Namespace)']]], + ['div16s_542',['div16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a187cb7282eb1b514b5795dcc8b0fcc',1,'cv::hal::div16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a187cb7282eb1b514b5795dcc8b0fcc',1,'div16s()(Global Namespace)']]], + ['div16u_543',['div16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaaffc26b52c8b8c88e741e6cc1bbaba21',1,'cv::hal::div16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaaffc26b52c8b8c88e741e6cc1bbaba21',1,'div16u()(Global Namespace)']]], + ['div32f_544',['div32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga39880dfe18797c0ddcee0992d50ac21e',1,'cv::hal::div32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga39880dfe18797c0ddcee0992d50ac21e',1,'div32f()(Global Namespace)']]], + ['div32s_545',['div32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae2511415ec8e1cb170392cfa9e8c0497',1,'cv::hal::div32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae2511415ec8e1cb170392cfa9e8c0497',1,'div32s()(Global Namespace)']]], + ['div64f_546',['div64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf3ea1e8b95e6e681e402dda0874bdaa4',1,'cv::hal::div64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf3ea1e8b95e6e681e402dda0874bdaa4',1,'div64f()(Global Namespace)']]], + ['div8s_547',['div8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga45f634c54c3ad6a9c5e9cace0b4d3e6e',1,'cv::hal::div8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga45f634c54c3ad6a9c5e9cace0b4d3e6e',1,'div8s()(Global Namespace)']]], + ['div8u_548',['div8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga48bae07fcb6715ecee852cc5c0189221',1,'cv::hal::div8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga48bae07fcb6715ecee852cc5c0189221',1,'div8u()(Global Namespace)']]], + ['divc_549',['divC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gabcbc1a4cc9301f8315b19b1aec4fd5d0',1,'cv::gapi::divC()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gabcbc1a4cc9301f8315b19b1aec4fd5d0',1,'divC()(Global Namespace)']]], + ['divide_550',['divide',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#aa8b2962155ee09a215639c59c50340f4',1,'cv::MatOp::divide(const MatExpr &expr1, const MatExpr &expr2, MatExpr &res, double scale=1) const'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a26a646bfe227f9731f502e97d728b3b7',1,'cv::MatOp::divide(double s, const MatExpr &expr, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6db555d30115642fedae0cda05604874',1,'cv::divide(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1f96b569cac4c286642b34eff098138e',1,'cv::divide(double scale, InputArray src2, OutputArray dst, int dtype=-1)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga124315aa226260841e25cc0b9ea99dc3',1,'cv::cuda::divide()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6db555d30115642fedae0cda05604874',1,'divide(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1f96b569cac4c286642b34eff098138e',1,'divide(double scale, InputArray src2, OutputArray dst, int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga124315aa226260841e25cc0b9ea99dc3',1,'divide(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d2c/group__core__hal__interface__divide.html',1,'Element-wise divide']]], + ['divides_551',['divides',['https://docs.opencv.org/4.2.0/de/d2a/structcv_1_1cudev_1_1divides.html',1,'cv::cudev::divides< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07367.html',1,'std::divides< class >']]], + ['divides_3c_20void_20_3e_552',['divides< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07391.html',1,'std']]], + ['division_5fk1_553',['division_k1',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a6aa622195d1d02a1796d3931791e70c8',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['division_5fk2_554',['division_k2',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#aad01910b47eafea00cbe58fd55e7b5e1',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['divrc_555',['divRC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gab715e84ee54c737916007ff7b8e6dcda',1,'cv::gapi::divRC()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gab715e84ee54c737916007ff7b8e6dcda',1,'divRC()(Global Namespace)']]], + ['divup_556',['divUp',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga52d39d0a7310cba0cf526bc9dbda5404',1,'cv::divUp(int a, unsigned int b)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga783150b042a28904f7df9e74788981e6',1,'cv::divUp(size_t a, unsigned int b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3ea029f9fa3603925b4162590cbf8d6',1,'cv::cudev::divUp()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga52d39d0a7310cba0cf526bc9dbda5404',1,'divUp(int a, unsigned int b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga783150b042a28904f7df9e74788981e6',1,'divUp(size_t a, unsigned int b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3ea029f9fa3603925b4162590cbf8d6',1,'divUp(int total, int grain)(Global Namespace)']]], + ['dmatch_557',['DMatch',['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html',1,'cv::DMatch'],['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#a546ddb9a87898f06e510e015a6de596e',1,'cv::DMatch::DMatch()'],['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#abcedc39e3f9c605472793d81ff5eb318',1,'cv::DMatch::DMatch(int _queryIdx, int _trainIdx, float _distance)'],['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#a43d07332011940086bae0ae4a43da06e',1,'cv::DMatch::DMatch(int _queryIdx, int _trainIdx, int _imgIdx, float _distance)']]], + ['dmatch_2ehpp_558',['dmatch.hpp',['https://docs.opencv.org/4.2.0/d7/de1/dmatch_8hpp.html',1,'']]], + ['dmatcher_559',['dmatcher',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html#a43311e57fce860293560e05a7e933424',1,'cv::BOWImgDescriptorExtractor']]], + ['dnn_20module_560',['Deep Neural Networks (dnn module)',['https://docs.opencv.org/4.2.0/d2/d58/tutorial_table_of_content_dnn.html',1,'']]], + ['dnn_20used_20for_20object_20detection_561',['DNN used for object detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'']]], + ['dnn_20used_20for_20super_20resolution_562',['DNN used for super resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'']]], + ['dnn_2ehpp_563',['dnn.hpp',['https://docs.opencv.org/4.2.0/db/ddc/dnn_2dnn_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d8c/dnn_8hpp.html',1,'(Global Namespace)']]], + ['dnn_5fandroid_2emarkdown_564',['dnn_android.markdown',['https://docs.opencv.org/4.2.0/de/d6f/dnn__android_8markdown.html',1,'']]], + ['dnn_5fbackend_5fcuda_565',['DNN_BACKEND_CUDA',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625ab242310e1ca6b405ead9308f4b66971c',1,'cv::dnn::DNN_BACKEND_CUDA'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625ab242310e1ca6b405ead9308f4b66971c',1,'DNN_BACKEND_CUDA(Global Namespace)']]], + ['dnn_5fbackend_5fdefault_566',['DNN_BACKEND_DEFAULT',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a51129aae9bc5df62a3ba95f98008717e',1,'cv::dnn::DNN_BACKEND_DEFAULT'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a51129aae9bc5df62a3ba95f98008717e',1,'DNN_BACKEND_DEFAULT(Global Namespace)']]], + ['dnn_5fbackend_5fhalide_567',['DNN_BACKEND_HALIDE',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625ab066325cd703cf32062246e77dca4a76',1,'cv::dnn::DNN_BACKEND_HALIDE'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625ab066325cd703cf32062246e77dca4a76',1,'DNN_BACKEND_HALIDE(Global Namespace)']]], + ['dnn_5fbackend_5finference_5fengine_568',['DNN_BACKEND_INFERENCE_ENGINE',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a6d17a7450b1e077ac91faa10a1e85486',1,'cv::dnn::DNN_BACKEND_INFERENCE_ENGINE'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a6d17a7450b1e077ac91faa10a1e85486',1,'DNN_BACKEND_INFERENCE_ENGINE(Global Namespace)']]], + ['dnn_5fbackend_5fopencv_569',['DNN_BACKEND_OPENCV',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a88591466239dde609ae676cec698a5b1',1,'cv::dnn::DNN_BACKEND_OPENCV'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a88591466239dde609ae676cec698a5b1',1,'DNN_BACKEND_OPENCV(Global Namespace)']]], + ['dnn_5fbackend_5fvkcom_570',['DNN_BACKEND_VKCOM',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a91dbe681fc3246a2bd36b04e7b65122f',1,'cv::dnn::DNN_BACKEND_VKCOM'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga186f7d9bfacac8b0ff2e26e2eab02625a91dbe681fc3246a2bd36b04e7b65122f',1,'DNN_BACKEND_VKCOM(Global Namespace)']]], + ['dnn_5fcustom_5flayers_2emd_571',['dnn_custom_layers.md',['https://docs.opencv.org/4.2.0/d6/ddf/dnn__custom__layers_8md.html',1,'']]], + ['dnn_5fgooglenet_2emarkdown_572',['dnn_googlenet.markdown',['https://docs.opencv.org/4.2.0/dc/d31/dnn__googlenet_8markdown.html',1,'']]], + ['dnn_5fhalide_2emarkdown_573',['dnn_halide.markdown',['https://docs.opencv.org/4.2.0/d0/d59/dnn__halide_8markdown.html',1,'']]], + ['dnn_5fhalide_5fscheduling_2emarkdown_574',['dnn_halide_scheduling.markdown',['https://docs.opencv.org/4.2.0/d6/d74/dnn__halide__scheduling_8markdown.html',1,'']]], + ['dnn_5fjavascript_2emarkdown_575',['dnn_javascript.markdown',['https://docs.opencv.org/4.2.0/da/d1b/dnn__javascript_8markdown.html',1,'']]], + ['dnn_5fobjdetect_5ftutorial_2emarkdown_576',['dnn_objdetect_tutorial.markdown',['https://docs.opencv.org/4.2.0/dd/d87/dnn__objdetect__tutorial_8markdown.html',1,'']]], + ['dnn_5fsuperres_2ehpp_577',['dnn_superres.hpp',['https://docs.opencv.org/4.2.0/d3/db0/dnn__superres_8hpp.html',1,'']]], + ['dnn_5ftarget_5fcpu_578',['DNN_TARGET_CPU',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a17439f29cc1356016ed533e465b03539',1,'cv::dnn::DNN_TARGET_CPU'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a17439f29cc1356016ed533e465b03539',1,'DNN_TARGET_CPU(Global Namespace)']]], + ['dnn_5ftarget_5fcuda_579',['DNN_TARGET_CUDA',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a5d7e050b90e78a923d304c328d16e5f1',1,'cv::dnn::DNN_TARGET_CUDA'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a5d7e050b90e78a923d304c328d16e5f1',1,'DNN_TARGET_CUDA(Global Namespace)']]], + ['dnn_5ftarget_5fcuda_5ffp16_580',['DNN_TARGET_CUDA_FP16',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a36a5a729e39ff249d590ea78170b6968',1,'cv::dnn::DNN_TARGET_CUDA_FP16'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a36a5a729e39ff249d590ea78170b6968',1,'DNN_TARGET_CUDA_FP16(Global Namespace)']]], + ['dnn_5ftarget_5ffpga_581',['DNN_TARGET_FPGA',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a03cfa62d77507ae5e32f8aa4e559f331',1,'cv::dnn::DNN_TARGET_FPGA'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a03cfa62d77507ae5e32f8aa4e559f331',1,'DNN_TARGET_FPGA(Global Namespace)']]], + ['dnn_5ftarget_5fmyriad_582',['DNN_TARGET_MYRIAD',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a17d5b540a9ee3ee726f181f309a223b3',1,'cv::dnn::DNN_TARGET_MYRIAD'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a17d5b540a9ee3ee726f181f309a223b3',1,'DNN_TARGET_MYRIAD(Global Namespace)']]], + ['dnn_5ftarget_5fopencl_583',['DNN_TARGET_OPENCL',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a45f8ea53f004e52665078a88167c7c08',1,'cv::dnn::DNN_TARGET_OPENCL'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5a45f8ea53f004e52665078a88167c7c08',1,'DNN_TARGET_OPENCL(Global Namespace)']]], + ['dnn_5ftarget_5fopencl_5ffp16_584',['DNN_TARGET_OPENCL_FP16',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5ab6d2643e6e5a3d0dfaca2ec69fd041b6',1,'cv::dnn::DNN_TARGET_OPENCL_FP16'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5ab6d2643e6e5a3d0dfaca2ec69fd041b6',1,'DNN_TARGET_OPENCL_FP16(Global Namespace)']]], + ['dnn_5ftarget_5fvulkan_585',['DNN_TARGET_VULKAN',['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5aacc0a9bdf5a6ecfca0bd6557470d5a8e',1,'cv::dnn::DNN_TARGET_VULKAN'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html#gga709af7692ba29788182cf573531b0ff5aacc0a9bdf5a6ecfca0bd6557470d5a8e',1,'DNN_TARGET_VULKAN(Global Namespace)']]], + ['dnn_5fyolo_2emarkdown_586',['dnn_yolo.markdown',['https://docs.opencv.org/4.2.0/dd/dfb/dnn__yolo_8markdown.html',1,'']]], + ['dnns_587',['YOLO DNNs',['https://docs.opencv.org/4.2.0/da/d9d/tutorial_dnn_yolo.html',1,'']]], + ['dnnsuperresimpl_588',['DnnSuperResImpl',['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1dnn__superres_1_1DnnSuperResImpl.html',1,'cv::dnn_superres::DnnSuperResImpl'],['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1dnn__superres_1_1DnnSuperResImpl.html#a5a9a8d189caa273fc210441f0858a8a3',1,'cv::dnn_superres::DnnSuperResImpl::DnnSuperResImpl()'],['https://docs.opencv.org/4.2.0/d8/d11/classcv_1_1dnn__superres_1_1DnnSuperResImpl.html#a21cf233916e32aca6719945aa929c156',1,'cv::dnn_superres::DnnSuperResImpl::DnnSuperResImpl(const std::string &algo, int scale)']]], + ['do_5fcompare_589',['do_compare',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a7392c4a1fc4373a7298d26b3994458f0',1,'std::collate::do_compare()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a7392c4a1fc4373a7298d26b3994458f0',1,'std::collate_byname::do_compare()']]], + ['do_5fcurr_5fsymbol_590',['do_curr_symbol',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a91f41433841daf2ac3426a6f3f08e63d',1,'std::moneypunct::do_curr_symbol()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a91f41433841daf2ac3426a6f3f08e63d',1,'std::moneypunct_byname::do_curr_symbol()']]], + ['do_5fdate_5forder_591',['do_date_order',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#ac3a094084d1cd2e48292635b48926c95',1,'std::time_get::do_date_order()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#ac3a094084d1cd2e48292635b48926c95',1,'std::time_get_byname::do_date_order()']]], + ['do_5fdecimal_5fpoint_592',['do_decimal_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ab8c59f589b65097279e206218ba986be',1,'std::moneypunct::do_decimal_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ab8c59f589b65097279e206218ba986be',1,'std::moneypunct_byname::do_decimal_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a760cc3ce936f6446b894cbe913948067',1,'std::numpunct::do_decimal_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a760cc3ce936f6446b894cbe913948067',1,'std::numpunct_byname::do_decimal_point()']]], + ['do_5ffalsename_593',['do_falsename',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aab0f0fa60cb43be85a93bad38bee99e4',1,'std::numpunct::do_falsename()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aab0f0fa60cb43be85a93bad38bee99e4',1,'std::numpunct_byname::do_falsename()']]], + ['do_5ffrac_5fdigits_594',['do_frac_digits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a43dc4eee49f0ad790bf920bf000888f9',1,'std::moneypunct::do_frac_digits()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a43dc4eee49f0ad790bf920bf000888f9',1,'std::moneypunct_byname::do_frac_digits()']]], + ['do_5fget_595',['do_get',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a2ed38702d328258ffd428b039602d92e',1,'std::messages::do_get()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a2ed38702d328258ffd428b039602d92e',1,'std::messages_byname::do_get()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a86e85bec7b677bbb2df712118b722ddc',1,'std::money_get::do_get(iter_type __s, iter_type __end, bool __intl, ios_base &__io, ios_base::iostate &__err, long double &__units) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a286ed4904b3dafae45d2df73168e3b40',1,'std::money_get::do_get(iter_type __s, iter_type __end, bool __intl, ios_base &__io, ios_base::iostate &__err, string_type &__digits) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#aee1742c1c979514fe11b7b1b6595e7ab',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, bool &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a03a67001904c1f1d5d4c34a958dedbbd',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a550d079dcba1f4140f26db766e3ae531',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned short &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#ac931765bfbbd5ba933fcb21d1bf22e7c',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned int &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a32976dd0309c30b4fa592e2d13f0cb5a',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a1d6a1d6af2dac3a1dde25e8ae1e72477',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, long long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a2b977609d4f92c8e1899dd4d76125c4f',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned long long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#abf3067e994fdf54ade5222e6f13cebcc',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, float &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a33556676f96535fa908ce805e35fda5b',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, double &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#adb04cb4c74797b0ef75038154d39f726',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, long double &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a30ca40af9407da445582b1a67c41db80',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, void *&) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#aee1742c1c979514fe11b7b1b6595e7ab',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, bool &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a03a67001904c1f1d5d4c34a958dedbbd',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a550d079dcba1f4140f26db766e3ae531',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned short &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#ac931765bfbbd5ba933fcb21d1bf22e7c',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned int &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a32976dd0309c30b4fa592e2d13f0cb5a',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a1d6a1d6af2dac3a1dde25e8ae1e72477',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, long long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a2b977609d4f92c8e1899dd4d76125c4f',1,'std::num_get::do_get(iter_type __beg, iter_type __end, ios_base &__io, ios_base::iostate &__err, unsigned long long &__v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#abf3067e994fdf54ade5222e6f13cebcc',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, float &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a33556676f96535fa908ce805e35fda5b',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, double &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#adb04cb4c74797b0ef75038154d39f726',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, long double &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a30ca40af9407da445582b1a67c41db80',1,'std::num_get::do_get(iter_type, iter_type, ios_base &, ios_base::iostate &, void *&) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#aac4032bde1366962ceb8004eb509917d',1,'std::time_get::do_get()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#aac4032bde1366962ceb8004eb509917d',1,'std::time_get_byname::do_get()']]], + ['do_5fget_5fdate_596',['do_get_date',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#acbe2321234fc8719d76b987b8eb57f31',1,'std::time_get::do_get_date()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#acbe2321234fc8719d76b987b8eb57f31',1,'std::time_get_byname::do_get_date()']]], + ['do_5fget_5fmonthname_597',['do_get_monthname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a87a19165aa361150c0810f123de4f13f',1,'std::time_get::do_get_monthname()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a87a19165aa361150c0810f123de4f13f',1,'std::time_get_byname::do_get_monthname()']]], + ['do_5fget_5ftime_598',['do_get_time',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#ad6ae8983f63115bc91c761bcb16264b2',1,'std::time_get::do_get_time()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#ad6ae8983f63115bc91c761bcb16264b2',1,'std::time_get_byname::do_get_time()']]], + ['do_5fget_5fweekday_599',['do_get_weekday',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a653300cbc2a2c8ec15fcd85acd9ef644',1,'std::time_get::do_get_weekday()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a653300cbc2a2c8ec15fcd85acd9ef644',1,'std::time_get_byname::do_get_weekday()']]], + ['do_5fget_5fyear_600',['do_get_year',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a04b1e9cd4573001efae175a8d2e4b8fa',1,'std::time_get::do_get_year()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a04b1e9cd4573001efae175a8d2e4b8fa',1,'std::time_get_byname::do_get_year()']]], + ['do_5fgrouping_601',['do_grouping',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#abedfe1ed30564977ec5d663d98a897cb',1,'std::moneypunct::do_grouping()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#abedfe1ed30564977ec5d663d98a897cb',1,'std::moneypunct_byname::do_grouping()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aa122f3820012ca748285e9e9f1559d12',1,'std::numpunct::do_grouping()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aa122f3820012ca748285e9e9f1559d12',1,'std::numpunct_byname::do_grouping()']]], + ['do_5fhash_602',['do_hash',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a0c49714f9b5bec2d7bc33a9a9b93919b',1,'std::collate::do_hash()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a0c49714f9b5bec2d7bc33a9a9b93919b',1,'std::collate_byname::do_hash()']]], + ['do_5fis_603',['do_is',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a13f6a9df12541e794f95b69dd7c12d8d',1,'__ctype_abstract_base< wchar_t >::do_is(mask __m, char_type __c) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a11e40e753bfcc987db52294dc0c99878',1,'__ctype_abstract_base< wchar_t >::do_is(const char_type *__lo, const char_type *__hi, mask *__vec) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a13f6a9df12541e794f95b69dd7c12d8d',1,'std::__ctype_abstract_base::do_is(mask __m, char_type __c) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a11e40e753bfcc987db52294dc0c99878',1,'std::__ctype_abstract_base::do_is(const char_type *__lo, const char_type *__hi, mask *__vec) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a35d540d6dbd1c06296f0bc0bddf8afe8',1,'std::ctype::do_is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a5013f2144fc72bd446537daa7d407ccd',1,'std::ctype::do_is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a5fddabd0a6f03cb5274020784a32eb72',1,'std::ctype< wchar_t >::do_is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a14be28229f0a8efde46ea9654297e556',1,'std::ctype< wchar_t >::do_is(const char_type *__lo, const char_type *__hi, mask *__vec) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a35d540d6dbd1c06296f0bc0bddf8afe8',1,'std::ctype_byname::do_is(mask __m, char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a5013f2144fc72bd446537daa7d407ccd',1,'std::ctype_byname::do_is(const char_type *__lo, const char_type *__hi, mask *__vec) const']]], + ['do_5fnarrow_604',['do_narrow',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ab2c37d0e04ecf5a71d618ca97478c893',1,'__ctype_abstract_base< wchar_t >::do_narrow(char_type __c, char __dfault) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a5bd09acf78baf8b8ae9cff1938cf6668',1,'__ctype_abstract_base< wchar_t >::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault, char *__to) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#ab2c37d0e04ecf5a71d618ca97478c893',1,'std::__ctype_abstract_base::do_narrow(char_type __c, char __dfault) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a5bd09acf78baf8b8ae9cff1938cf6668',1,'std::__ctype_abstract_base::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault, char *__to) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a01a3c227801621bd3ca9b3568c44c3a0',1,'std::ctype::do_narrow(char_type, char __dfault) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#abc730453d5fc2d3dca9e557ccc7b4394',1,'std::ctype::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault, char *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a136c4d09f8241b6d30657175f3361f4a',1,'std::ctype< char >::do_narrow(char_type __c, char __dfault __attribute__((__unused__))) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a41ccb4858b9456fcfc9bd5946314ef49',1,'std::ctype< char >::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault __attribute__((__unused__)), char *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a4c0c870d5d7ec8a6d942da3a03597da2',1,'std::ctype< wchar_t >::do_narrow(char_type __c, char __dfault) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#af77b64ba799c73ab7566f159d5dee756',1,'std::ctype< wchar_t >::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault, char *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a01a3c227801621bd3ca9b3568c44c3a0',1,'std::ctype_byname::do_narrow(char_type, char __dfault) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#abc730453d5fc2d3dca9e557ccc7b4394',1,'std::ctype_byname::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault, char *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a136c4d09f8241b6d30657175f3361f4a',1,'std::ctype_byname< char >::do_narrow(char_type __c, char __dfault __attribute__((__unused__))) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a41ccb4858b9456fcfc9bd5946314ef49',1,'std::ctype_byname< char >::do_narrow(const char_type *__lo, const char_type *__hi, char __dfault __attribute__((__unused__)), char *__to) const']]], + ['do_5fneg_5fformat_605',['do_neg_format',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ab059421016ae9ce7368de1b1911c07b6',1,'std::moneypunct::do_neg_format()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ab059421016ae9ce7368de1b1911c07b6',1,'std::moneypunct_byname::do_neg_format()']]], + ['do_5fnegative_5fsign_606',['do_negative_sign',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a3bac54f35225e34bd08144beacff4e2e',1,'std::moneypunct::do_negative_sign()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a3bac54f35225e34bd08144beacff4e2e',1,'std::moneypunct_byname::do_negative_sign()']]], + ['do_5fout_607',['do_out',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#aa969d1e16dd100e737c5d777aa0cdf02',1,'__codecvt_abstract_base< _InternT, _ExternT, encoding_state >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#aa969d1e16dd100e737c5d777aa0cdf02',1,'__codecvt_abstract_base< char, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#aa969d1e16dd100e737c5d777aa0cdf02',1,'__codecvt_abstract_base< char16_t, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#aa969d1e16dd100e737c5d777aa0cdf02',1,'__codecvt_abstract_base< char32_t, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#aa969d1e16dd100e737c5d777aa0cdf02',1,'__codecvt_abstract_base< wchar_t, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05199.html#a5cdde44b6d296efa567c0cc94bca6f08',1,'codecvt< _Elem, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#aa969d1e16dd100e737c5d777aa0cdf02',1,'std::__codecvt_abstract_base::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05199.html#a5cdde44b6d296efa567c0cc94bca6f08',1,'std::codecvt::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10335.html#ae1283355554c11b6ce2d3dacc9e6cba0',1,'std::codecvt< _InternT, _ExternT, encoding_state >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05203.html#adc5c0e2cc9d18affc9bf2888d351d699',1,'std::codecvt< char, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05211.html#a16f65a78cd4179ab7115490453e3664e',1,'std::codecvt< char16_t, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05215.html#a1767804ef887e46a422d005ca31e2500',1,'std::codecvt< char32_t, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05207.html#a56bc3e4682156830a84159babb38d611',1,'std::codecvt< wchar_t, char, mbstate_t >::do_out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05199.html#a5cdde44b6d296efa567c0cc94bca6f08',1,'std::codecvt_byname::do_out()']]], + ['do_5fpos_5fformat_608',['do_pos_format',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ad1f8646969be5d63e0edea945a902a60',1,'std::moneypunct::do_pos_format()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ad1f8646969be5d63e0edea945a902a60',1,'std::moneypunct_byname::do_pos_format()']]], + ['do_5fpositive_5fsign_609',['do_positive_sign',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a8d259d10ed08942f602ee96986584bba',1,'std::moneypunct::do_positive_sign()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a8d259d10ed08942f602ee96986584bba',1,'std::moneypunct_byname::do_positive_sign()']]], + ['do_5fput_610',['do_put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a04355d4b3e8b632d51659efce1362135',1,'std::money_put::do_put(iter_type __s, bool __intl, ios_base &__io, char_type __fill, long double __units) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#ab38a5a1a94a3354fa54dc4af38e72cb4',1,'std::money_put::do_put(iter_type __s, bool __intl, ios_base &__io, char_type __fill, const string_type &__digits) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a751c0d4e60210056dc7e8ea6f3bbd405',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, bool __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a7d1915d312132bf998bdf29b6969afe7',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a075dbdca32501d714e181253cb4614b1',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, unsigned long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#adb43c423d095bd32b806c4e44fd63cfb',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#aba459b0ab5eb2763880fd3897607ac74',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, unsigned long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a15bcd2e90efb4755b2f3d2b900773f8e',1,'std::num_put::do_put(iter_type, ios_base &, char_type, double) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a80c7eac50b4f62c5300c437ef7c31ac6',1,'std::num_put::do_put(iter_type, ios_base &, char_type, long double) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a2448fac36fa28f3a8af076b66ce70db1',1,'std::num_put::do_put(iter_type, ios_base &, char_type, const void *) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a751c0d4e60210056dc7e8ea6f3bbd405',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, bool __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a7d1915d312132bf998bdf29b6969afe7',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a075dbdca32501d714e181253cb4614b1',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, unsigned long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#adb43c423d095bd32b806c4e44fd63cfb',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#aba459b0ab5eb2763880fd3897607ac74',1,'std::num_put::do_put(iter_type __s, ios_base &__io, char_type __fill, unsigned long long __v) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a15bcd2e90efb4755b2f3d2b900773f8e',1,'std::num_put::do_put(iter_type, ios_base &, char_type, double) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a80c7eac50b4f62c5300c437ef7c31ac6',1,'std::num_put::do_put(iter_type, ios_base &, char_type, long double) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#a2448fac36fa28f3a8af076b66ce70db1',1,'std::num_put::do_put(iter_type, ios_base &, char_type, const void *) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a40f507cdd7cc0221fcb9053beda997c9',1,'std::time_put::do_put()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#a40f507cdd7cc0221fcb9053beda997c9',1,'std::time_put_byname::do_put()']]], + ['do_5fscan_5fis_611',['do_scan_is',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a6d63444db4c605c256c36343394bb883',1,'__ctype_abstract_base< wchar_t >::do_scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a6d63444db4c605c256c36343394bb883',1,'std::__ctype_abstract_base::do_scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a9e5dfcb79a7718c330889862788e1279',1,'std::ctype::do_scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#acf1b6dfec89abd4d28e306b7f3cf7c23',1,'std::ctype< wchar_t >::do_scan_is()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a9e5dfcb79a7718c330889862788e1279',1,'std::ctype_byname::do_scan_is()']]], + ['do_5fscan_5fnot_612',['do_scan_not',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a40c1314bb60f9b9795ec8e628ffbcc34',1,'__ctype_abstract_base< wchar_t >::do_scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a40c1314bb60f9b9795ec8e628ffbcc34',1,'std::__ctype_abstract_base::do_scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#ad5c6efb9e8be0613aee87070a24098ef',1,'std::ctype::do_scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a4d9f6191ed300d3ab5e728e7a90047b2',1,'std::ctype< wchar_t >::do_scan_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#ad5c6efb9e8be0613aee87070a24098ef',1,'std::ctype_byname::do_scan_not()']]], + ['do_5fthousands_5fsep_613',['do_thousands_sep',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#abede1cc31a6d8a5dc30c382092e379f3',1,'std::moneypunct::do_thousands_sep()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#abede1cc31a6d8a5dc30c382092e379f3',1,'std::moneypunct_byname::do_thousands_sep()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aca44112e2524a51069b7bd674723b36e',1,'std::numpunct::do_thousands_sep()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aca44112e2524a51069b7bd674723b36e',1,'std::numpunct_byname::do_thousands_sep()']]], + ['do_5ftolower_614',['do_tolower',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a322123706f52d8c72b9c8bee3f612676',1,'__ctype_abstract_base< wchar_t >::do_tolower(char_type __c) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#afe5fc2040092e4f8fb6e88d253f4d3c3',1,'__ctype_abstract_base< wchar_t >::do_tolower(char_type *__lo, const char_type *__hi) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a322123706f52d8c72b9c8bee3f612676',1,'std::__ctype_abstract_base::do_tolower(char_type __c) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#afe5fc2040092e4f8fb6e88d253f4d3c3',1,'std::__ctype_abstract_base::do_tolower(char_type *__lo, const char_type *__hi) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a59a0ada1cc334c6c407e43af870d291e',1,'std::ctype::do_tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#aac256f247d2f52ca6f81f42a0bed6992',1,'std::ctype::do_tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#ac019737df7ce6bff299aa60d7d6b18b0',1,'std::ctype< char >::do_tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#afe122310bbeed79c8451587e257ca463',1,'std::ctype< char >::do_tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#ad8989f20ff67441f84cc2e286d34d594',1,'std::ctype< wchar_t >::do_tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#abaacddaf3a1d3adeed77aeaa71bc1a2e',1,'std::ctype< wchar_t >::do_tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a59a0ada1cc334c6c407e43af870d291e',1,'std::ctype_byname::do_tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#aac256f247d2f52ca6f81f42a0bed6992',1,'std::ctype_byname::do_tolower(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#ac019737df7ce6bff299aa60d7d6b18b0',1,'std::ctype_byname< char >::do_tolower(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#afe122310bbeed79c8451587e257ca463',1,'std::ctype_byname< char >::do_tolower(char_type *__lo, const char_type *__hi) const']]], + ['do_5ftoupper_615',['do_toupper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af90fbcc9340edf7ca0002520cccb0b8f',1,'__ctype_abstract_base< wchar_t >::do_toupper(char_type __c) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a51eeaf4fefdd3a85b0706028cec0c5e7',1,'__ctype_abstract_base< wchar_t >::do_toupper(char_type *__lo, const char_type *__hi) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#af90fbcc9340edf7ca0002520cccb0b8f',1,'std::__ctype_abstract_base::do_toupper(char_type __c) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a51eeaf4fefdd3a85b0706028cec0c5e7',1,'std::__ctype_abstract_base::do_toupper(char_type *__lo, const char_type *__hi) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a292e998fb0eeeef612c4e879ead72bc9',1,'std::ctype::do_toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a2df6c745f13674152565a8dd6a88d9b3',1,'std::ctype::do_toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a0baaa8202343a9c588635910b4fa4d7d',1,'std::ctype< char >::do_toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aaa8745e5d3c653ba8252ec926519bb60',1,'std::ctype< char >::do_toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a56659902a772ea65838dd6481268e099',1,'std::ctype< wchar_t >::do_toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a446b87f9dde5a37ca18d7bfa07dfa80d',1,'std::ctype< wchar_t >::do_toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a292e998fb0eeeef612c4e879ead72bc9',1,'std::ctype_byname::do_toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a2df6c745f13674152565a8dd6a88d9b3',1,'std::ctype_byname::do_toupper(char_type *__lo, const char_type *__hi) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a0baaa8202343a9c588635910b4fa4d7d',1,'std::ctype_byname< char >::do_toupper(char_type __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aaa8745e5d3c653ba8252ec926519bb60',1,'std::ctype_byname< char >::do_toupper(char_type *__lo, const char_type *__hi) const']]], + ['do_5ftransform_616',['do_transform',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a17895df009fcf8d929823aea3f1adbba',1,'std::collate::do_transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#a17895df009fcf8d929823aea3f1adbba',1,'std::collate_byname::do_transform()']]], + ['do_5ftruename_617',['do_truename',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#ae560023d22e2e9c686f97f87b397c07d',1,'std::numpunct::do_truename()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#ae560023d22e2e9c686f97f87b397c07d',1,'std::numpunct_byname::do_truename()']]], + ['do_5fwiden_618',['do_widen',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0f4951419f48a08bd975cb49a81995a5',1,'__ctype_abstract_base< wchar_t >::do_widen(char __c) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a289ae9e9ce16c7c26a8356b4610c7dee',1,'__ctype_abstract_base< wchar_t >::do_widen(const char *__lo, const char *__hi, char_type *__to) const =0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a0f4951419f48a08bd975cb49a81995a5',1,'std::__ctype_abstract_base::do_widen(char __c) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05915.html#a289ae9e9ce16c7c26a8356b4610c7dee',1,'std::__ctype_abstract_base::do_widen(const char *__lo, const char *__hi, char_type *__to) const=0'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a7d464e73ba99ec097116cb63a9f99761',1,'std::ctype::do_widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#aacb919dc096268066282f4dae1abcfc9',1,'std::ctype::do_widen(const char *__lo, const char *__hi, char_type *__dest) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a37bae5847ddd2a3e9dda66b2bb663f38',1,'std::ctype< char >::do_widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#ad1c0a38350b682ac361a85ca1ac6ddc5',1,'std::ctype< char >::do_widen(const char *__lo, const char *__hi, char_type *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#a027a349455fcbe1572794e5e6ffc25b3',1,'std::ctype< wchar_t >::do_widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#ad2118710f1ca2b452af0cf54ee179c56',1,'std::ctype< wchar_t >::do_widen(const char *__lo, const char *__hi, char_type *__to) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#a7d464e73ba99ec097116cb63a9f99761',1,'std::ctype_byname::do_widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#aacb919dc096268066282f4dae1abcfc9',1,'std::ctype_byname::do_widen(const char *__lo, const char *__hi, char_type *__dest) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#a37bae5847ddd2a3e9dda66b2bb663f38',1,'std::ctype_byname< char >::do_widen(char __c) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#ad1c0a38350b682ac361a85ca1ac6ddc5',1,'std::ctype_byname< char >::do_widen(const char *__lo, const char *__hi, char_type *__to) const']]], + ['docorrectionforinclusion_619',['doCorrectionForInclusion',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ab72fa834ec03b7db3d1c1926b8c900e6',1,'cv::videostab::StabilizerBase']]], + ['docorrectionforinclusion_5f_620',['doCorrectionForInclusion_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a14468697674d4710267abeaba1dfefbe',1,'cv::videostab::StabilizerBase']]], + ['documentation_20for_20opencv_621',['Writing documentation for OpenCV',['https://docs.opencv.org/4.2.0/d4/db1/tutorial_documentation.html',1,'']]], + ['documentation_5ftutorial_2emarkdown_622',['documentation_tutorial.markdown',['https://docs.opencv.org/4.2.0/d6/d6b/documentation__tutorial_8markdown.html',1,'']]], + ['dodeblurring_5f_623',['doDeblurring_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a39b55a0336972805eab06cab1ac0e727',1,'cv::videostab::StabilizerBase']]], + ['doinpainting_5f_624',['doInpainting_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a5705ca2493231a2b041412434b25d37b',1,'cv::videostab::StabilizerBase']]], + ['domain_5ferror_625',['domain_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02795.html',1,'std']]], + ['dontalign_626',['DontAlign',['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13a56908522e51443a0aa0567f879c2e78a',1,'Eigen::DontAlign'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggaacded1a18ae58b0f554751f6cdf9eb13a56908522e51443a0aa0567f879c2e78a',1,'DontAlign(Global Namespace)']]], + ['dooneiteration_627',['doOneIteration',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ade2bda91481dab757bf2ffe3f4f27465',1,'cv::videostab::StabilizerBase']]], + ['dot_628',['dot',['https://docs.opencv.org/4.2.0/d1/dfd/structcv_1_1optflow_1_1GPCPatchDescriptor.html#a288f37934866eb0e753303e789973c05',1,'cv::optflow::GPCPatchDescriptor::dot()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a0f683eab191eeece33dfc64ae299a9cb',1,'cv::Mat::dot()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2e20e53ae2e09a0f0575d9f3987067c1',1,'cv::MatExpr::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'cv::Matx::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< _Tp, cn, 1 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, 1, 3 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, 2, 2 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, 2, 3 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, 3, 3 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, 3, 4 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, 4, 4 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< double, cn, 1 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< float, 2, 3 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< float, 3, 3 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< float, cn, 1 >::dot()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aff0ce90dadd68822c348b0bbae4a5f2a',1,'Matx< float_type, 4, 4 >::dot()'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a26936af228834ab76b93d1b922fa4762',1,'cv::Point3_::dot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a4728ce98be0240d836c4896021688aa5',1,'cv::Point_::dot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a4728ce98be0240d836c4896021688aa5',1,'Point_< double >::dot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a4728ce98be0240d836c4896021688aa5',1,'Point_< float >::dot()'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a4728ce98be0240d836c4896021688aa5',1,'Point_< int >::dot()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a6daed34dfaccf50a34aca1d1ee5e5027',1,'cv::UMat::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adfd32bf5fcf6ee603c924dde9bf7bc39',1,'Eigen::MatrixBase::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adfd32bf5fcf6ee603c924dde9bf7bc39',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adfd32bf5fcf6ee603c924dde9bf7bc39',1,'MatrixBase< Solve< Decomposition, RhsType > >::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa2d22c5b321c9539dd625ca415422236',1,'Eigen::QuaternionBase::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa2d22c5b321c9539dd625ca415422236',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa2d22c5b321c9539dd625ca415422236',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::dot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa2d22c5b321c9539dd625ca415422236',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::dot()']]], + ['doublefpconfig_629',['doubleFPConfig',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a47b02c6821d4b193d5f20fc3d6f1a727',1,'cv::ocl::Device']]], + ['down_5fcast_630',['down_cast',['https://docs.opencv.org/4.2.0/d4/d88/namespacecv_1_1internal.html#a38a46a178fc203af27735cab909db334',1,'cv::internal']]], + ['downhillsolver_631',['DownhillSolver',['https://docs.opencv.org/4.2.0/d4/d43/classcv_1_1DownhillSolver.html',1,'cv']]], + ['download_632',['download',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a027e74e4364ddfd9687b58aa5db8d4e8',1,'cv::cuda::GpuMat::download(OutputArray dst) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a2522fd0642c30e0455ec52a28bd3be7b',1,'cv::cuda::GpuMat::download(OutputArray dst, Stream &stream) const'],['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#a7e71003dc04d6e3b1ec6eb884a6b541a',1,'cv::MatAllocator::download()']]], + ['downloaddescriptors_633',['downloadDescriptors',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#aa810356f1c5eb81474735ec57a5bdea4',1,'cv::cuda::SURF_CUDA']]], + ['downloadkeypoints_634',['downloadKeypoints',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a2d01e23e3092305d4a57fdeccca8c961',1,'cv::cuda::SURF_CUDA']]], + ['downloadresults_635',['downloadResults',['https://docs.opencv.org/4.2.0/d2/dcd/classcv_1_1cuda_1_1HoughLinesDetector.html#acdcc2461e0f46ebda28dee9d8dcf912d',1,'cv::cuda::HoughLinesDetector']]], + ['dowobblesuppression_5f_636',['doWobbleSuppression_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#aac5c916da3621d2367acb9abb6b6dee6',1,'cv::videostab::TwoPassStabilizer']]], + ['doxygen_20projects_637',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], + ['dp_638',['DP',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a3117ebd577b9a33c143918ecacfa5c0e',1,'cv::tracking::UnscentedKalmanFilterParams']]], + ['dp_5fseam_639',['DP_SEAM',['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html#aa8c4c8cb01e15b4652116630d93c3eb2a9dd52fcf64f3609ac84cebbef9fc1c9b',1,'cv::detail::SeamFinder']]], + ['dpm_2ehpp_640',['dpm.hpp',['https://docs.opencv.org/4.2.0/da/d8a/dpm_8hpp.html',1,'']]], + ['dpmdetector_641',['DPMDetector',['https://docs.opencv.org/4.2.0/df/dba/classcv_1_1dpm_1_1DPMDetector.html',1,'cv::dpm']]], + ['dpseamfinder_642',['DpSeamFinder',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html',1,'cv::detail::DpSeamFinder'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a1ab92a71baf2444abf8129e3bddc7151',1,'cv::detail::DpSeamFinder::DpSeamFinder(CostFunction costFunc=COLOR)'],['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a83359299259252cd362d91b3734ffba6',1,'cv::detail::DpSeamFinder::DpSeamFinder(String costFunc)']]], + ['draw_643',['draw',['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html#a5f1b7c91bd8bf8271931d6f06292f1bc',1,'cv::aruco::CharucoBoard::draw()'],['https://docs.opencv.org/4.2.0/de/d05/classcv_1_1aruco_1_1GridBoard.html#aae344f00868cd472c430303c3cbfa998',1,'cv::aruco::GridBoard::draw()']]], + ['draw_5fover_5foutimg_644',['DRAW_OVER_OUTIMG',['https://docs.opencv.org/4.2.0/d8/d6f/structcv_1_1line__descriptor_1_1DrawLinesMatchesFlags.html#af77f9b45585f16821d7a06ea38909e68a7be06b0d6664e11916bc8337ffd0f965',1,'cv::line_descriptor::DrawLinesMatchesFlags::DRAW_OVER_OUTIMG'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a32be7350ff5af15003fcaddf36653971',1,'DRAW_OVER_OUTIMG(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a32be7350ff5af15003fcaddf36653971',1,'DRAW_OVER_OUTIMG(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8a32be7350ff5af15003fcaddf36653971',1,'DRAW_OVER_OUTIMG(Global Namespace)']]], + ['draw_5frich_5fkeypoints_645',['DRAW_RICH_KEYPOINTS',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8ad640260b7dc8b32e0bf35c2696da24f8',1,'DRAW_RICH_KEYPOINTS(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8ad640260b7dc8b32e0bf35c2696da24f8',1,'DRAW_RICH_KEYPOINTS(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8ad640260b7dc8b32e0bf35c2696da24f8',1,'DRAW_RICH_KEYPOINTS(Global Namespace)']]], + ['drawactivetracks_646',['drawActiveTracks',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a30df875f7c57899a83310ae789293522',1,'cv::tbm::ITrackerByMatching']]], + ['drawaxis_647',['drawAxis',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga16fda651a4e6a8f5747a85cbb6b400a2',1,'cv::aruco::drawAxis()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga16fda651a4e6a8f5747a85cbb6b400a2',1,'drawAxis()(Global Namespace)']]], + ['drawcharucodiamond_648',['drawCharucoDiamond',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gaf71fb897d5f03f7424c0c84715aa6228',1,'cv::aruco::drawCharucoDiamond()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gaf71fb897d5f03f7424c0c84715aa6228',1,'drawCharucoDiamond()(Global Namespace)']]], + ['drawchessboardcorners_649',['drawChessboardCorners',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga6a10b0bb120c4907e5eabbcd22319022',1,'cv::drawChessboardCorners()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga6a10b0bb120c4907e5eabbcd22319022',1,'drawChessboardCorners()(Global Namespace)']]], + ['drawcolordisp_650',['drawColorDisp',['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#ga469b23a77938dd7c06861e59cecc08c5',1,'cv::cuda::drawColorDisp()'],['https://docs.opencv.org/4.2.0/dd/d47/group__cudastereo.html#ga469b23a77938dd7c06861e59cecc08c5',1,'drawColorDisp()(Global Namespace)']]], + ['drawcontours_651',['drawContours',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga746c0625f1781f1ffc9056259103edbc',1,'cv::drawContours()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga746c0625f1781f1ffc9056259103edbc',1,'drawContours()(Global Namespace)']]], + ['drawdetectedcornerscharuco_652',['drawDetectedCornersCharuco',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga7225eee644190f791e1583c499b7ab10',1,'cv::aruco::drawDetectedCornersCharuco()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga7225eee644190f791e1583c499b7ab10',1,'drawDetectedCornersCharuco()(Global Namespace)']]], + ['drawdetecteddiamonds_653',['drawDetectedDiamonds',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga0dbf27203267fb8e9f282554cf0d3433',1,'cv::aruco::drawDetectedDiamonds()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga0dbf27203267fb8e9f282554cf0d3433',1,'drawDetectedDiamonds()(Global Namespace)']]], + ['drawdetectedmarkers_654',['drawDetectedMarkers',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga2ad34b0f277edebb6a132d3069ed2909',1,'cv::aruco::drawDetectedMarkers()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga2ad34b0f277edebb6a132d3069ed2909',1,'drawDetectedMarkers()(Global Namespace)']]], + ['drawfacemarks_655',['drawFacemarks',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#ga318d9669d5ed4dfc6ab9fae2715310f5',1,'cv::face::drawFacemarks()'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#ga318d9669d5ed4dfc6ab9fae2715310f5',1,'drawFacemarks()(Global Namespace)']]], + ['drawfeatures_656',['drawFeatures',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0a8042ae6ca72f3da2f441be6e117bd9',1,'cv::linemod::drawFeatures()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0a8042ae6ca72f3da2f441be6e117bd9',1,'drawFeatures()(Global Namespace)']]], + ['drawframeaxes_657',['drawFrameAxes',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gab3ab7bb2bdfe7d5d9745bb92d13f9564',1,'cv::drawFrameAxes()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gab3ab7bb2bdfe7d5d9745bb92d13f9564',1,'drawFrameAxes(InputOutputArray image, InputArray cameraMatrix, InputArray distCoeffs, InputArray rvec, InputArray tvec, float length, int thickness=3)(Global Namespace)']]], + ['drawing_658',['Basic Drawing',['https://docs.opencv.org/4.2.0/d3/d96/tutorial_basic_geometric_drawing.html',1,'']]], + ['drawing_20and_20composition_20functionality_659',['G-API Drawing and composition functionality',['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'']]], + ['drawing_20function_20of_20keypoints_20and_20matches_660',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], + ['drawing_20functions_661',['Drawing Functions',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html',1,'']]], + ['drawing_20functions_20in_20opencv_662',['Drawing Functions in OpenCV',['https://docs.opencv.org/4.2.0/dc/da5/tutorial_py_drawing_functions.html',1,'']]], + ['drawing_20operations_20and_20functions_663',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], + ['drawing_20primitives_664',['Drawing primitives',['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html',1,'']]], + ['drawing_20utf_208_20strings_20with_20freetype_20harfbuzz_665',['Drawing UTF-8 strings with freetype/harfbuzz',['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html',1,'']]], + ['drawkeylines_666',['drawKeylines',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html#ga5e8cbc3c61c763a03474ce02141ce7e4',1,'cv::line_descriptor::drawKeylines()'],['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html#ga5e8cbc3c61c763a03474ce02141ce7e4',1,'drawKeylines()(Global Namespace)']]], + ['drawkeypoints_667',['drawKeypoints',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga5d2bafe8c1c45289bc3403a40fb88920',1,'cv::drawKeypoints()'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga5d2bafe8c1c45289bc3403a40fb88920',1,'drawKeypoints()(Global Namespace)']]], + ['drawlinematches_668',['drawLineMatches',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html#ga01e43c974ddb735d39dd7124499f40ab',1,'cv::line_descriptor::drawLineMatches()'],['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html#ga01e43c974ddb735d39dd7124499f40ab',1,'drawLineMatches()(Global Namespace)']]], + ['drawlinesmatchesflags_669',['DrawLinesMatchesFlags',['https://docs.opencv.org/4.2.0/d8/d6f/structcv_1_1line__descriptor_1_1DrawLinesMatchesFlags.html',1,'cv::line_descriptor']]], + ['drawmarker_670',['drawMarker',['https://docs.opencv.org/4.2.0/d5/d0b/classcv_1_1aruco_1_1Dictionary.html#a3b3199ddd6c9ca7ed04c3bdf88477d15',1,'cv::aruco::Dictionary::drawMarker()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga644c4a170d4799a56b29f864ce984b7e',1,'cv::drawMarker()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga254ed245e10c5b3e2259d5d9b8ea8e2f',1,'cv::aruco::drawMarker()'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga644c4a170d4799a56b29f864ce984b7e',1,'drawMarker(InputOutputArray img, Point position, const Scalar &color, int markerType=MARKER_CROSS, int markerSize=20, int thickness=1, int line_type=8)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga254ed245e10c5b3e2259d5d9b8ea8e2f',1,'drawMarker(const Ptr< Dictionary > &dictionary, int id, int sidePixels, OutputArray img, int borderBits=1)(Global Namespace)']]], + ['drawmatches_671',['drawMatches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#gad8f463ccaf0dc6f61083abd8717c261a',1,'cv::drawMatches(InputArray img1, const std::vector< KeyPoint > &keypoints1, InputArray img2, const std::vector< KeyPoint > &keypoints2, const std::vector< DMatch > &matches1to2, InputOutputArray outImg, const Scalar &matchColor=Scalar::all(-1), const Scalar &singlePointColor=Scalar::all(-1), const std::vector< char > &matchesMask=std::vector< char >(), DrawMatchesFlags flags=DrawMatchesFlags::DEFAULT)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga62fbedb5206ab2faf411797e7055c90f',1,'cv::drawMatches(InputArray img1, const std::vector< KeyPoint > &keypoints1, InputArray img2, const std::vector< KeyPoint > &keypoints2, const std::vector< std::vector< DMatch > > &matches1to2, InputOutputArray outImg, const Scalar &matchColor=Scalar::all(-1), const Scalar &singlePointColor=Scalar::all(-1), const std::vector< std::vector< char > > &matchesMask=std::vector< std::vector< char > >(), DrawMatchesFlags flags=DrawMatchesFlags::DEFAULT)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#gad8f463ccaf0dc6f61083abd8717c261a',1,'drawMatches(InputArray img1, const std::vector< KeyPoint > &keypoints1, InputArray img2, const std::vector< KeyPoint > &keypoints2, const std::vector< DMatch > &matches1to2, InputOutputArray outImg, const Scalar &matchColor=Scalar::all(-1), const Scalar &singlePointColor=Scalar::all(-1), const std::vector< char > &matchesMask=std::vector< char >(), DrawMatchesFlags flags=DrawMatchesFlags::DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga62fbedb5206ab2faf411797e7055c90f',1,'drawMatches(InputArray img1, const std::vector< KeyPoint > &keypoints1, InputArray img2, const std::vector< KeyPoint > &keypoints2, const std::vector< std::vector< DMatch > > &matches1to2, InputOutputArray outImg, const Scalar &matchColor=Scalar::all(-1), const Scalar &singlePointColor=Scalar::all(-1), const std::vector< std::vector< char > > &matchesMask=std::vector< std::vector< char > >(), DrawMatchesFlags flags=DrawMatchesFlags::DEFAULT)(Global Namespace)']]], + ['drawmatchesflags_672',['DrawMatchesFlags',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8',1,'cv::DrawMatchesFlags'],['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html#ga2c2ede79cd5141534ae70a3fd9f324c8',1,'DrawMatchesFlags(Global Namespace)']]], + ['draworientation_673',['drawOrientation',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a3ba4d56fe50a572e0edbd42e8ce246a6',1,'cv::ccalib::CustomPattern']]], + ['drawplanarboard_674',['drawPlanarBoard',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gacc98e7993d9f78c9eb1250f030896e85',1,'cv::aruco::drawPlanarBoard()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gacc98e7993d9f78c9eb1250f030896e85',1,'drawPlanarBoard()(Global Namespace)']]], + ['drawsegments_675',['drawSegments',['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1ximgproc_1_1FastLineDetector.html#aacfbe367964959be1173013f53912fc5',1,'cv::ximgproc::FastLineDetector::drawSegments()'],['https://docs.opencv.org/4.2.0/db/d73/classcv_1_1LineSegmentDetector.html#a1816a3c27f7c9b8d8acffec14451d4c4',1,'cv::LineSegmentDetector::drawSegments()']]], + ['drawsignature_676',['drawSignature',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#a3e206c0847ce9f4474b6084deec1bc84',1,'cv::xfeatures2d::PCTSignatures']]], + ['driverversion_677',['driverVersion',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a370bb5033106a4f4feb09cc6813c566f',1,'cv::ocl::Device']]], + ['drivetowaypointcommand_678',['DriveToWaypointCommand',['../classcommands_1_1DriveToWaypointCommand.html',1,'commands::DriveToWaypointCommand'],['../classcommands_1_1DriveToWaypointCommand.html#ad0d25fcc0a835db6386bcaa2a1cbada9',1,'commands::DriveToWaypointCommand::DriveToWaypointCommand()']]], + ['drop_5fforgotten_5ftracks_679',['drop_forgotten_tracks',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#ad55c5f9a39a856f1be90df7abfe71ad3',1,'cv::tbm::TrackerParams']]], + ['dropforgottentrack_680',['dropForgottenTrack',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a4954acdfb5fbf5afa657a0ca65738975',1,'cv::tbm::ITrackerByMatching']]], + ['dropforgottentracks_681',['dropForgottenTracks',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#abd51c5e24d08a6011a8475006cbed972',1,'cv::tbm::ITrackerByMatching']]], + ['dropoutliers_682',['dropOutliers',['https://docs.opencv.org/4.2.0/d0/dba/classcv_1_1optflow_1_1GPCDetails.html#abeab00b6118efef02aae861afc12f5a0',1,'cv::optflow::GPCDetails']]], + ['dscreate_683',['dscreate',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a0f8b59fb69fc0ffeb2abb6e413d00885',1,'cv::hdf::HDF5::dscreate(const int rows, const int cols, const int type, const String &dslabel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#abe6abf5b602170b2f5f9a6553d6d3654',1,'cv::hdf::HDF5::dscreate(const int rows, const int cols, const int type, const String &dslabel, const int compresslevel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a77a0140c5df98a3969f0cae1bd6f20e1',1,'cv::hdf::HDF5::dscreate(const int rows, const int cols, const int type, const String &dslabel, const int compresslevel, const vector< int > &dims_chunks) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#adb40bb34c486048a1dd3a19f70a4bb32',1,'cv::hdf::HDF5::dscreate(const int rows, const int cols, const int type, const String &dslabel, const int compresslevel, const int *dims_chunks) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#ac92451730b86bc222ed9c859dc659d0f',1,'cv::hdf::HDF5::dscreate(const int n_dims, const int *sizes, const int type, const String &dslabel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#ae727e22a530c6bd624b36a8d2b72a889',1,'cv::hdf::HDF5::dscreate(const int n_dims, const int *sizes, const int type, const String &dslabel, const int compresslevel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#ab7b3aaab7b40babf5fa208c21a2a370b',1,'cv::hdf::HDF5::dscreate(const vector< int > &sizes, const int type, const String &dslabel, const int compresslevel=HDF5::H5_NONE, const vector< int > &dims_chunks=vector< int >()) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a56fa3b7affaa49cb0418895f572e2841',1,'cv::hdf::HDF5::dscreate(const int n_dims, const int *sizes, const int type, const String &dslabel, const int compresslevel, const int *dims_chunks) const=0']]], + ['dsgetsize_684',['dsgetsize',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a7bb2404c7381d5dd9c16f526dc780513',1,'cv::hdf::HDF5']]], + ['dsgettype_685',['dsgettype',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a6e718bd24804c3a47ac2df03294b5b60',1,'cv::hdf::HDF5']]], + ['dsinsert_686',['dsinsert',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a066531c8c803361851b278667f5442a7',1,'cv::hdf::HDF5::dsinsert(InputArray Array, const String &dslabel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#af3df2e41bad99a4b74c915567f84a3b0',1,'cv::hdf::HDF5::dsinsert(InputArray Array, const String &dslabel, const int *dims_offset) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a12a80b308989a80f72cdfe88f1b6e935',1,'cv::hdf::HDF5::dsinsert(InputArray Array, const String &dslabel, const vector< int > &dims_offset, const vector< int > &dims_counts=vector< int >()) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a8ed41a770f3b262ba62d8e51ff91e9bd',1,'cv::hdf::HDF5::dsinsert(InputArray Array, const String &dslabel, const int *dims_offset, const int *dims_counts) const=0']]], + ['dsread_687',['dsread',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#afc0f24683dbce852884f2147a68ddae3',1,'cv::hdf::HDF5::dsread(OutputArray Array, const String &dslabel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a6088901b1c715aad6164b27b83262479',1,'cv::hdf::HDF5::dsread(OutputArray Array, const String &dslabel, const int *dims_offset) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a849ed15c7d4697f562c2f230332b16fc',1,'cv::hdf::HDF5::dsread(OutputArray Array, const String &dslabel, const vector< int > &dims_offset, const vector< int > &dims_counts=vector< int >()) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a61e2bfc6d35271a160fdfec69c1a2157',1,'cv::hdf::HDF5::dsread(OutputArray Array, const String &dslabel, const int *dims_offset, const int *dims_counts) const=0']]], + ['dst_688',['dst',['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a5ff8f9c8577ce053ead74561ed861b07',1,'cv::MatxCommaInitializer::dst'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a5ff8f9c8577ce053ead74561ed861b07',1,'MatxCommaInitializer< _Tp, m, 1 >::dst']]], + ['dst_5f_689',['dst_',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#ad30226780c00964fa9278a9e8f1d4515',1,'cv::detail::Blender::dst_'],['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#a5dc38f7fd7af8f4a7d3cfbcd12ba0431',1,'cv::detail::Timelapser::dst_']]], + ['dst_5fimg_5fidx_690',['dst_img_idx',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#a1f0c77660d4fcff5caeacd18dda1fa7e',1,'cv::detail::MatchesInfo']]], + ['dst_5fmask_5f_691',['dst_mask_',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#a0104ca2f8e48ec1da37089a76129ff86',1,'cv::detail::Blender']]], + ['dst_5froi_5f_692',['dst_roi_',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#a2d4bafbbb6dd7e87882bf88128bdd92f',1,'cv::detail::Blender::dst_roi_'],['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#a63b3c97d45e3aa3dcbe3b62019b4849a',1,'cv::detail::Timelapser::dst_roi_']]], + ['dswrite_693',['dswrite',['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#adc4bb3ba821d6ea52a7d8b6b9f623c85',1,'cv::hdf::HDF5::dswrite(InputArray Array, const String &dslabel) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a575120ad1a8857b1fa2db4cb05488e81',1,'cv::hdf::HDF5::dswrite(InputArray Array, const String &dslabel, const int *dims_offset) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a996681e3faff692b8d94502164599ad3',1,'cv::hdf::HDF5::dswrite(InputArray Array, const String &dslabel, const vector< int > &dims_offset, const vector< int > &dims_counts=vector< int >()) const=0'],['https://docs.opencv.org/4.2.0/d3/d23/classcv_1_1hdf_1_1HDF5.html#a0aa86fc0ec7a74dadd53da977ce0d181',1,'cv::hdf::HDF5::dswrite(InputArray Array, const String &dslabel, const int *dims_offset, const int *dims_counts) const=0']]], + ['dtf_5fic_694',['DTF_IC',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50ba750b04bda8b3a538f473695b3c6e4134',1,'cv::ximgproc::DTF_IC'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50ba750b04bda8b3a538f473695b3c6e4134',1,'DTF_IC(Global Namespace)']]], + ['dtf_5fnc_695',['DTF_NC',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50bae7471def53e472acdd9d5ff027f3b2d2',1,'cv::ximgproc::DTF_NC'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50bae7471def53e472acdd9d5ff027f3b2d2',1,'DTF_NC(Global Namespace)']]], + ['dtf_5frf_696',['DTF_RF',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50ba87c50252b836691c3aec0e7cee7e2c43',1,'cv::ximgproc::DTF_RF'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ggadd1227d417ac1d12db3444fa5cdcb50ba87c50252b836691c3aec0e7cee7e2c43',1,'DTF_RF(Global Namespace)']]], + ['dtfilter_697',['DTFilter',['https://docs.opencv.org/4.2.0/d3/d9d/classcv_1_1ximgproc_1_1DTFilter.html',1,'cv::ximgproc']]], + ['dtfilter_698',['dtFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga420d830e628e79e8e8ba0f97c098b8b8',1,'cv::ximgproc::dtFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga420d830e628e79e8e8ba0f97c098b8b8',1,'dtFilter()(Global Namespace)']]], + ['dtrees_699',['DTrees',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html',1,'cv::ml']]], + ['dualtvl1opticalflow_700',['DualTVL1OpticalFlow',['https://docs.opencv.org/4.2.0/dc/d4d/classcv_1_1optflow_1_1DualTVL1OpticalFlow.html',1,'cv::optflow::DualTVL1OpticalFlow'],['https://docs.opencv.org/4.2.0/d6/db1/classcv_1_1superres_1_1DualTVL1OpticalFlow.html',1,'cv::superres::DualTVL1OpticalFlow']]], + ['dummy_2eh_701',['dummy.h',['https://docs.opencv.org/4.2.0/d2/d94/dummy_8h.html',1,'']]], + ['dumnode_5fconst_5fiterator_702',['dumnode_const_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11659.html',1,'__gnu_pbds::detail']]], + ['dump_703',['dump',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#ac4d2758cc4cbf52564f8715645fa93a8',1,'cv::dnn::Net::dump()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a476756fb08e7f2416aad116d137977f4.html#a476756fb08e7f2416aad116d137977f4',1,'nlohmann::basic_json::dump()']]], + ['dumpbool_704',['dumpBool',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf80f610b81e838865974de31a2c7f632',1,'cv::utils::dumpBool()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf80f610b81e838865974de31a2c7f632',1,'dumpBool()(Global Namespace)']]], + ['dumpcstring_705',['dumpCString',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabc97db0a4f7f5675a47bab6c25384713',1,'cv::utils::dumpCString()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabc97db0a4f7f5675a47bab6c25384713',1,'dumpCString()(Global Namespace)']]], + ['dumpdouble_706',['dumpDouble',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga81eda02bc7fd9b7e5b656bab76ae0443',1,'cv::utils::dumpDouble()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga81eda02bc7fd9b7e5b656bab76ae0443',1,'dumpDouble()(Global Namespace)']]], + ['dumpfloat_707',['dumpFloat',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6510785b47105a8b2254d034b3d1a22c',1,'cv::utils::dumpFloat()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6510785b47105a8b2254d034b3d1a22c',1,'dumpFloat()(Global Namespace)']]], + ['dumpinputarray_708',['dumpInputArray',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabbbbf8c36017475930ae8817189e9fa6',1,'cv::utils::dumpInputArray()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabbbbf8c36017475930ae8817189e9fa6',1,'dumpInputArray()(Global Namespace)']]], + ['dumpinputarrayofarrays_709',['dumpInputArrayOfArrays',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabe4f2b9ed3bcc3988cc26e962d0d3eb7',1,'cv::utils::dumpInputArrayOfArrays()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gabe4f2b9ed3bcc3988cc26e962d0d3eb7',1,'dumpInputArrayOfArrays()(Global Namespace)']]], + ['dumpinputoutputarray_710',['dumpInputOutputArray',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5cc7a521c0e256cb0e5a0236e3ed3f23',1,'cv::utils::dumpInputOutputArray()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5cc7a521c0e256cb0e5a0236e3ed3f23',1,'dumpInputOutputArray()(Global Namespace)']]], + ['dumpinputoutputarrayofarrays_711',['dumpInputOutputArrayOfArrays',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaa300bc8cdf4508113efe926f3fce7d72',1,'cv::utils::dumpInputOutputArrayOfArrays()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaa300bc8cdf4508113efe926f3fce7d72',1,'dumpInputOutputArrayOfArrays()(Global Namespace)']]], + ['dumpint_712',['dumpInt',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5a32f315f1a230c21820493ca48c21cb',1,'cv::utils::dumpInt()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5a32f315f1a230c21820493ca48c21cb',1,'dumpInt()(Global Namespace)']]], + ['dumpopenclinformation_713',['dumpOpenCLInformation',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a03e8f397da42cdf6c6c0d1c9cc0cb9f8',1,'cv']]], + ['dumpsizet_714',['dumpSizeT',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf17a637927d8015219f77b7c7f34741b',1,'cv::utils::dumpSizeT()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf17a637927d8015219f77b7c7f34741b',1,'dumpSizeT()(Global Namespace)']]], + ['dumptofile_715',['dumpToFile',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a4f7d0d1e650571e11d988d07f7ed5a7d',1,'cv::dnn::Net']]], + ['duration_716',['duration',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01839.html',1,'std::chrono']]], + ['duration_3c_20double_2c_20std_3a_3achrono_3a_3aseconds_3a_3aperiod_20_3e_717',['duration< double, std::chrono::seconds::period >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01839.html',1,'std::chrono']]], + ['duration_5fcast_718',['duration_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01559.html#a5143d479bd882a4ff638451dc57e49ed',1,'std::chrono']]], + ['duration_5fvalues_719',['duration_values',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01899.html',1,'std::chrono']]], + ['durationns_720',['durationNS',['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#a146c5d94482fa478c731265029ad7259',1,'cv::ocl::Timer']]], + ['durationtosec_721',['durationToSec',['../namespaceutil.html#a4d368bf202be12ecd7f66176f3088da3',1,'util']]], + ['dx_722',['dx',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#a518302f717934b076db95ff3b2172de3',1,'cv::datasets::FR_adienceObj::dx'],['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#a2bd85a691e68108000f8daa23474784e',1,'cv::QtFont::dx']]], + ['dy_723',['dy',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#adbf87933fa98b33544838484513c1282',1,'cv::datasets::FR_adienceObj']]], + ['dynafu_724',['DynaFu',['https://docs.opencv.org/4.2.0/d1/d20/classcv_1_1dynafu_1_1DynaFu.html',1,'cv::dynafu']]], + ['dynafu_2ehpp_725',['dynafu.hpp',['https://docs.opencv.org/4.2.0/dc/dcf/dynafu_8hpp.html',1,'']]], + ['dynamic_726',['Dynamic',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad81fa7195215a0ce30017dfac309f0b2',1,'Eigen']]], + ['dynamic_20bitset_727',['Dynamic Bitset.',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html',1,'']]], + ['dynamic_20range_20hdr_728',['High Dynamic Range (HDR)',['https://docs.opencv.org/4.2.0/d2/df0/tutorial_py_hdr.html',1,'']]], + ['dynamic_20range_20imaging_729',['High Dynamic Range Imaging',['https://docs.opencv.org/4.2.0/d3/db7/tutorial_hdr_imaging.html',1,'']]], + ['dynamic_5fbitset_730',['dynamic_bitset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html',1,'std::tr2::dynamic_bitset< _WordT, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00995.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a37c4cf25cf2f0122ba3c952d5f4fb136',1,'std::tr2::dynamic_bitset::dynamic_bitset()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a14f9010fa71c5ff2382e8a81e2cb9187',1,'std::tr2::dynamic_bitset::dynamic_bitset(const allocator_type &__alloc)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a09163c15d91003865f72d3d11313daae',1,'std::tr2::dynamic_bitset::dynamic_bitset(size_type __nbits, unsigned long long __val=0ULL, const allocator_type &__alloc=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a83d4afb31d435543ed57f61f452c7ad5',1,'std::tr2::dynamic_bitset::dynamic_bitset(const std::basic_string< _CharT, _Traits, _Alloc1 > &__str, typename basic_string< _CharT, _Traits, _Alloc1 >::size_type __pos=0, typename basic_string< _CharT, _Traits, _Alloc1 >::size_type __n=std::basic_string< _CharT, _Traits, _Alloc1 >::npos, _CharT __zero=_CharT( '0'), _CharT __one=_CharT( '1'), const allocator_type &__alloc=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a4cfedc13b3f271fdf44774168e0f9178',1,'std::tr2::dynamic_bitset::dynamic_bitset(const char *__str, const allocator_type &__alloc=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a09f32eaa5007a2adc583f9dc1d8b807f',1,'std::tr2::dynamic_bitset::dynamic_bitset(const dynamic_bitset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aa8aa690fe197432110dfadbd8f055c13',1,'std::tr2::dynamic_bitset::dynamic_bitset(dynamic_bitset &&__b) noexcept']]], + ['dynamic_5fbitset_2eh_731',['dynamic_bitset.h',['https://docs.opencv.org/4.2.0/da/d5c/dynamic__bitset_8h.html',1,'']]], + ['dynamic_5fbitset_2etcc_732',['dynamic_bitset.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00989.html',1,'']]], + ['dynamic_5fparallelism_733',['DYNAMIC_PARALLELISM',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a2d8ef1fc50ce9e89ea1e058b6ba9df47',1,'cv::cuda::DYNAMIC_PARALLELISM'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a2d8ef1fc50ce9e89ea1e058b6ba9df47',1,'DYNAMIC_PARALLELISM(Global Namespace)']]], + ['dynamic_5fpointer_5fcast_734',['dynamic_pointer_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aea22d7ec8d3648b381cf98d0ba570e9b',1,'std']]], + ['dynamic_5fsmem_2ehpp_735',['dynamic_smem.hpp',['https://docs.opencv.org/4.2.0/d3/d73/modules_2core_2include_2opencv2_2core_2cuda_2dynamic__smem_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d15/contrib_2modules_2cudev_2include_2opencv2_2cudev_2block_2dynamic__smem_8hpp.html',1,'(Global Namespace)']]], + ['dynamicgop_736',['DynamicGOP',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#ae378f8c62fddf88f8b30a41e239d29e3',1,'cv::cudacodec::EncoderParams']]], + ['dynamicindex_737',['DynamicIndex',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a73c597189a4a99127175e8167c456fff',1,'Eigen']]], + ['dynamicsharedmem_738',['DynamicSharedMem',['https://docs.opencv.org/4.2.0/d3/d2b/structcv_1_1cudev_1_1DynamicSharedMem.html',1,'cv::cudev']]], + ['dynamicsharedmem_3c_20double_20_3e_739',['DynamicSharedMem< double >',['https://docs.opencv.org/4.2.0/db/d28/structcv_1_1cudev_1_1DynamicSharedMem_3_01double_01_4.html',1,'cv::cudev']]] ]; diff --git a/search/all_e.js b/search/all_e.js index b34b585a..283d4858 100644 --- a/search/all_e.js +++ b/search/all_e.js @@ -32,466 +32,461 @@ var searchData= ['efficient_20matrix_20product_20expressions_29',['Writing efficient matrix product expressions',['https://eigen.tuxfamily.org/dox/TopicWritingEfficientProductExpression.html',1,'']]], ['egptr_30',['egptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'__gnu_cxx::enc_filebuf::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'__gnu_cxx::enc_filebuf::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'__gnu_cxx::stdio_filebuf::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'__gnu_cxx::stdio_filebuf::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'__gnu_cxx::stdio_sync_filebuf::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'__gnu_cxx::stdio_sync_filebuf::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'basic_filebuf< char_type, traits_type >::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'basic_filebuf< char_type, traits_type >::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'basic_streambuf< _Elem, _Tr >::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'basic_streambuf< _Elem, _Tr >::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'basic_streambuf< char, _Traits >::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'basic_streambuf< char, _Traits >::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'basic_streambuf< char, char_traits< char > >::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'basic_streambuf< char, char_traits< char > >::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'std::basic_filebuf::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'std::basic_filebuf::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'std::basic_streambuf::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'std::basic_streambuf::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'std::basic_stringbuf::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'std::basic_stringbuf::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'std::wbuffer_convert::egptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ad02de7bae6f055a7b112aeef35a08d9b',1,'std::wbuffer_convert::egptr() const']]], ['egrep_31',['egrep',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a20359992d27c0743cae90e4bae7f8129',1,'std::regex_constants']]], - ['eigen_32',['Eigen',['https://eigen.tuxfamily.org/dox/namespaceEigen.html',1,'']]], + ['eigen_32',['Eigen',['https://eigen.tuxfamily.org/dox/namespaceEigen.html',1,'Eigen'],['https://eigen.tuxfamily.org/dox/Experimental.html',1,'Experimental parts of Eigen'],['https://eigen.tuxfamily.org/dox/TopicEigenExpressionTemplates.html',1,'Expression templates in Eigen'],['https://eigen.tuxfamily.org/dox/UserManual_CustomizingEigen.html',1,'Extending/Customizing Eigen'],['https://eigen.tuxfamily.org/dox/UserManual_UnderstandingEigen.html',1,'Understanding Eigen'],['https://eigen.tuxfamily.org/dox/TopicUsingBlasLapack.html',1,'Using BLAS/LAPACK from Eigen'],['https://eigen.tuxfamily.org/dox/TopicUsingIntelMKL.html',1,'Using Intel® MKL from Eigen'],['https://eigen.tuxfamily.org/dox/group__TopicStlContainers.html',1,'Using STL Containers with Eigen']]], ['eigen_33',['eigen',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9fa0d58657f60eaa6c71f6fbb40456e3',1,'cv::eigen()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9fa0d58657f60eaa6c71f6fbb40456e3',1,'eigen(InputArray src, OutputArray eigenvalues, OutputArray eigenvectors=noArray())(Global Namespace)']]], - ['eigen_34',['Eigen',['https://eigen.tuxfamily.org/dox/Experimental.html',1,'Experimental parts of Eigen'],['https://eigen.tuxfamily.org/dox/TopicEigenExpressionTemplates.html',1,'Expression templates in Eigen'],['https://eigen.tuxfamily.org/dox/UserManual_CustomizingEigen.html',1,'Extending/Customizing Eigen'],['https://eigen.tuxfamily.org/dox/UserManual_UnderstandingEigen.html',1,'Understanding Eigen'],['https://eigen.tuxfamily.org/dox/TopicUsingBlasLapack.html',1,'Using BLAS/LAPACK from Eigen'],['https://eigen.tuxfamily.org/dox/TopicUsingIntelMKL.html',1,'Using Intel® MKL from Eigen'],['https://eigen.tuxfamily.org/dox/group__TopicStlContainers.html',1,'Using STL Containers with Eigen']]], - ['eigen_20and_20multi_20threading_35',['Eigen and multi-threading',['https://eigen.tuxfamily.org/dox/TopicMultiThreading.html',1,'']]], - ['eigen_20in_20cmake_20projects_36',['Using Eigen in CMake Projects',['https://eigen.tuxfamily.org/dox/TopicCMakeGuide.html',1,'']]], - ['eigen_20in_20cuda_20kernels_37',['Using Eigen in CUDA kernels',['https://eigen.tuxfamily.org/dox/TopicCUDA.html',1,'']]], - ['eigen_20members_38',['Structures Having Eigen Members',['https://eigen.tuxfamily.org/dox/group__TopicStructHavingEigenMembers.html',1,'']]], - ['eigen_20objects_39',['Fixed-size vectorizable Eigen objects',['https://eigen.tuxfamily.org/dox/group__TopicFixedSizeVectorizable.html',1,'']]], - ['eigen_20objects_20by_20value_20to_20functions_40',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], - ['eigen_20on_20a_20simple_20example_41',['What happens inside Eigen, on a simple example',['https://eigen.tuxfamily.org/dox/TopicInsideEigenExample.html',1,'']]], - ['eigen_20support_42',['Eigen support',['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html',1,'']]], - ['eigen_20types_20as_20parameters_43',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], - ['eigen_2ehpp_44',['eigen.hpp',['https://docs.opencv.org/4.2.0/d3/ddd/eigen_8hpp.html',1,'']]], - ['eigen2cv_45',['eigen2cv',['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gabf167b4c7d0dbed6bc3ae6e3fda25734',1,'cv::eigen2cv(const Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gac9fd7b6d6cc93f82b77da378f9565be3',1,'cv::eigen2cv(const Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &src, Matx< _Tp, _rows, _cols > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gabf167b4c7d0dbed6bc3ae6e3fda25734',1,'eigen2cv(const Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gac9fd7b6d6cc93f82b77da378f9565be3',1,'eigen2cv(const Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &src, Matx< _Tp, _rows, _cols > &dst)(Global Namespace)']]], - ['eigen_3a_3adoxygen_46',['doxygen',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'Eigen']]], - ['eigen_3a_3aindexing_47',['indexing',['https://eigen.tuxfamily.org/dox/namespaceEigen_1_1indexing.html',1,'Eigen']]], - ['eigen_3a_3amap_48',['Eigen::Map',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a44523f8b49c90154f6195c6f04666499',1,'Eigen::PlainObjectBase::Map'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ade83ff019d359dc837c0f4b697eb5027',1,'Eigen::PlainObjectBase::Map'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a52f7d6b523cce948a7804a7aeef210f9',1,'Eigen::PlainObjectBase::Map']]], - ['eigen_3a_3asimplicialcholeskybase_49',['SimplicialCholeskyBase',['https://eigen.tuxfamily.org/dox/structEigen_1_1SimplicialCholeskyBase_1_1keep__diag.html',1,'Eigen']]], - ['eigen_3a_3asymbolic_50',['symbolic',['https://eigen.tuxfamily.org/dox/namespaceEigen_1_1symbolic.html',1,'Eigen']]], - ['eigen_5fexpr_5fbinaryop_5fscalar_5freturn_5ftype_51',['EIGEN_EXPR_BINARYOP_SCALAR_RETURN_TYPE',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ab4950605c14c530c2d56c75f0e253d10',1,'Eigen::AlignedBox']]], - ['eigen_5fmake_5faligned_5foperator_5fnew_5fif_5fvectorizable_5ffixed_5fsize_52',['EIGEN_MAKE_ALIGNED_OPERATOR_NEW_IF_VECTORIZABLE_FIXED_SIZE',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a30c94c2156e9345f4bdb6cc9661e275b',1,'Eigen::Transform']]], - ['eigenbase_53',['EigenBase',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'Eigen']]], - ['eigenbase_3c_20bandmatrix_3c_20_5fscalar_2c_20rows_2c_20cols_2c_20supers_2c_20subs_2c_20options_20_3e_20_3e_54',['EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20bandmatrix_3c_20scalar_2c_20rows_2c_20cols_2c_20supers_2c_20subs_2c_20options_20_3e_20_3e_55',['EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20block_3c_20xprtype_2c_20blockrows_2c_20blockcols_2c_20innerpanel_20_3e_20_3e_56',['EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20block_3c_20xprtype_2c_20blockrows_2c_20blockcols_2c_20true_20_3e_20_3e_57',['EigenBase< Block< XprType, BlockRows, BlockCols, true > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20colpivhouseholderqr_3c_20_5fmatrixtype_20_3e_20_3e_58',['EigenBase< ColPivHouseholderQR< _MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20colpivhouseholderqr_3c_20matrixtype_20_3e_20_3e_59',['EigenBase< ColPivHouseholderQR< MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20completeorthogonaldecomposition_3c_20_5fmatrixtype_20_3e_20_3e_60',['EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20cwisebinaryop_3c_20binaryop_2c_20lhs_2c_20rhs_20_3e_20_3e_61',['EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20fullpivhouseholderqr_3c_20_5fmatrixtype_20_3e_20_3e_62',['EigenBase< FullPivHouseholderQR< _MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20fullpivlu_3c_20_5fmatrixtype_20_3e_20_3e_63',['EigenBase< FullPivLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20householderqr_3c_20_5fmatrixtype_20_3e_20_3e_64',['EigenBase< HouseholderQR< _MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20householdersequence_3c_20vectorstype_2c_20coeffstype_2c_20side_20_3e_20_3e_65',['EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20inverse_3c_20permutationtype_20_3e_20_3e_66',['EigenBase< Inverse< PermutationType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20ldlt_3c_20_5fmatrixtype_2c_20_5fuplo_20_3e_20_3e_67',['EigenBase< LDLT< _MatrixType, _UpLo > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20llt_3c_20_5fmatrixtype_2c_20_5fuplo_20_3e_20_3e_68',['EigenBase< LLT< _MatrixType, _UpLo > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20map_3c_20permutationmatrix_3c_20sizeatcompiletime_2c_20maxsizeatcompiletime_2c_20_5fstorageindex_20_3e_2c_20_5fpacketaccess_20_3e_20_3e_69',['EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20partialpivlu_3c_20_5fmatrixtype_20_3e_20_3e_70',['EigenBase< PartialPivLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20permutationmatrix_3c_20sizeatcompiletime_2c_20maxsizeatcompiletime_2c_20_5fstorageindex_20_3e_20_3e_71',['EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20permutationmatrix_3c_20sizeatcompiletime_2c_20maxsizeatcompiletime_2c_20storageindex_20_3e_20_3e_72',['EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20permutationwrapper_3c_20_5findicestype_20_3e_20_3e_73',['EigenBase< PermutationWrapper< _IndicesType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20selfadjointview_3c_20_5fmatrixtype_2c_20uplo_20_3e_20_3e_74',['EigenBase< SelfAdjointView< _MatrixType, UpLo > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20selfadjointview_3c_20const_20derived_2c_20uplo_20_3e_20_3e_75',['EigenBase< SelfAdjointView< const Derived, UpLo > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20sparseselfadjointview_3c_20const_20derived_2c_20_5fmode_20_3e_20_3e_76',['EigenBase< SparseSelfAdjointView< const Derived, _Mode > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20sparseselfadjointview_3c_20matrixtype_2c_20_5fmode_20_3e_20_3e_77',['EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20sparsesymmetricpermutationproduct_3c_20matrixtype_2c_20mode_20_3e_20_3e_78',['EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20svdbase_3c_20derived_20_3e_20_3e_79',['EigenBase< SVDBase< Derived > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20svdbase_3c_20jacobisvd_3c_20_5fmatrixtype_2c_20qrpreconditioner_20_3e_20_3e_20_3e_80',['EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20transpose_3c_20matrixtype_20_3e_20_3e_81',['EigenBase< Transpose< MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20triangularview_3c_20_5fmatrixtype_2c_20_5fmode_20_3e_20_3e_82',['EigenBase< TriangularView< _MatrixType, _Mode > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenbase_3c_20triangularview_3c_20matrixtype_2c_20mode_20_3e_20_3e_83',['EigenBase< TriangularView< MatrixType, Mode > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], - ['eigenfacerecognizer_84',['EigenFaceRecognizer',['https://docs.opencv.org/4.2.0/dd/d7c/classcv_1_1face_1_1EigenFaceRecognizer.html',1,'cv::face']]], - ['eigennonsymmetric_85',['eigenNonSymmetric',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf51987e03cac8d171fbd2b327cf966f6',1,'cv::eigenNonSymmetric()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf51987e03cac8d171fbd2b327cf966f6',1,'eigenNonSymmetric()(Global Namespace)']]], - ['eigensolver_86',['EigenSolver',['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html',1,'Eigen::EigenSolver< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a3af22d721a6401365881b2ef252d26aa',1,'Eigen::EigenSolver::EigenSolver()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a7e8ab3d89ea525af5f27f1a8e805fae1',1,'Eigen::EigenSolver::EigenSolver(const EigenBase< InputType > &matrix, bool computeEigenvectors=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#aa4edf56ecc178b277b75c13a2ca1089f',1,'Eigen::EigenSolver::EigenSolver(Index size)']]], - ['eigenvalues_87',['eigenvalues',['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a1c9d34c02df49120474a4a366b971303',1,'cv::PCA::eigenvalues'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a09eeb511758f419c8d079489e2c5c939',1,'cv::LDA::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a10c25c7620e7faedcd39991cce3a757b',1,'Eigen::ComplexEigenSolver::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a114189009e42f5e03372a7a3dfa33b97',1,'Eigen::EigenSolver::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#a62f01cd78271efd5e39bcb24e0fe1a58',1,'Eigen::GeneralizedEigenSolver::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a30430fa3d5b4e74d312fd4f502ac984d',1,'Eigen::MatrixBase::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a30430fa3d5b4e74d312fd4f502ac984d',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a30430fa3d5b4e74d312fd4f502ac984d',1,'MatrixBase< Solve< Decomposition, RhsType > >::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a3df8721abcc71132f7f02bf9dfe78e41',1,'Eigen::SelfAdjointEigenSolver::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad4f34424b4ea12de9bbc5623cb938b4f',1,'Eigen::SelfAdjointView::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad4f34424b4ea12de9bbc5623cb938b4f',1,'SelfAdjointView< const Derived, UpLo >::eigenvalues()']]], - ['eigenvalues_20module_88',['Eigenvalues module',['https://eigen.tuxfamily.org/dox/group__Eigenvalues__Module.html',1,'']]], - ['eigenvaluesonly_89',['EigenvaluesOnly',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9afd06633f270207c373875fd7ca03e906',1,'Eigen::EigenvaluesOnly'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9afd06633f270207c373875fd7ca03e906',1,'EigenvaluesOnly(Global Namespace)']]], - ['eigenvaluesreturntype_90',['EigenvaluesReturnType',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a8ae92703d920130b38a383f8b165146c',1,'Eigen::SelfAdjointView::EigenvaluesReturnType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a8ae92703d920130b38a383f8b165146c',1,'SelfAdjointView< const Derived, UpLo >::EigenvaluesReturnType']]], - ['eigenvaluetype_91',['EigenvalueType',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#ad3a663b1ff5200a098dabbbf9b7162b1',1,'Eigen::ComplexEigenSolver::EigenvalueType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#adc446bcb60572758fa64515f2825db62',1,'Eigen::EigenSolver::EigenvalueType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#ad59af178acc401f1bc4e330ef80f286d',1,'Eigen::GeneralizedEigenSolver::EigenvalueType']]], - ['eigenvectors_92',['eigenvectors',['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a8fed85cf5f9d8bb9b17f031398cb74a0',1,'cv::PCA::eigenvectors'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a70ef2afa53f4eb93b4b98a8e359cc628',1,'cv::LDA::eigenvectors()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a3aa5e27800349990778da8fa532c1270',1,'Eigen::ComplexEigenSolver::eigenvectors()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a66288022802172e3ee059283b26201d7',1,'Eigen::EigenSolver::eigenvectors()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a229c4c26d87c5d2663cd3cc8a4c68266',1,'Eigen::SelfAdjointEigenSolver::eigenvectors()']]], - ['eigenvectorstype_93',['EigenvectorsType',['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#aa140354e2f7d5ce34c6488c39e19f2c2',1,'Eigen::EigenSolver::EigenvectorsType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#afffec018dbb2d87b4c09b6acecbb79cd',1,'Eigen::GeneralizedEigenSolver::EigenvectorsType']]], - ['eigenvectortype_94',['EigenvectorType',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a67cd4d20590abfd86b2639c4c8ea3dd6',1,'Eigen::ComplexEigenSolver']]], - ['elapsedtime_95',['elapsedTime',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#a871ed8b4c5f721f4898e3c407d781a2c',1,'cv::cuda::Event::elapsedTime()'],['../classutil_1_1ScopedTimer.html#a8b5106706ff6007114bf545852b2b5cc',1,'util::ScopedTimer::elapsedTime()']]], - ['elem_96',['elem',['https://docs.opencv.org/4.2.0/dd/dbd/structcv_1_1datasets_1_1pose.html#a8140e9c34dc6a750d75c61f70d8333ed',1,'cv::datasets::pose']]], - ['elem_5ftype_97',['elem_type',['https://docs.opencv.org/4.2.0/dc/df8/structcv_1_1cudev_1_1VecTraits_3_01char1_01_4.html#a921ebef7a08fc241e001af0342271bbc',1,'cv::cudev::VecTraits< char1 >::elem_type'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1cudev_1_1VecTraits_3_01char2_01_4.html#ac96d012dba5d1ae71ee2909c7b11ba69',1,'cv::cudev::VecTraits< char2 >::elem_type'],['https://docs.opencv.org/4.2.0/df/de4/structcv_1_1cudev_1_1VecTraits_3_01char3_01_4.html#a4b3baea99f1f00df348f7e8f09e4ffd9',1,'cv::cudev::VecTraits< char3 >::elem_type'],['https://docs.opencv.org/4.2.0/dc/df6/structcv_1_1cudev_1_1VecTraits_3_01char4_01_4.html#ab979cfebcea5d7105ee1bdfaa4c21ae9',1,'cv::cudev::VecTraits< char4 >::elem_type'],['https://docs.opencv.org/4.2.0/d1/d4e/structcv_1_1cudev_1_1VecTraits_3_01double_01_4.html#ae82eed5fee383d5d0bd280262e5c9d3e',1,'cv::cudev::VecTraits< double >::elem_type'],['https://docs.opencv.org/4.2.0/d1/de1/structcv_1_1cudev_1_1VecTraits_3_01double1_01_4.html#afa69e1110e0e456a411664e6f97cfc78',1,'cv::cudev::VecTraits< double1 >::elem_type'],['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1VecTraits_3_01double2_01_4.html#a4d694688056736966effd57a68ca33a0',1,'cv::cudev::VecTraits< double2 >::elem_type'],['https://docs.opencv.org/4.2.0/d5/d24/structcv_1_1cudev_1_1VecTraits_3_01double3_01_4.html#a2e59a7457ad0d503cb268cfd2474f4a1',1,'cv::cudev::VecTraits< double3 >::elem_type'],['https://docs.opencv.org/4.2.0/d1/d5d/structcv_1_1cudev_1_1VecTraits_3_01double4_01_4.html#a01ad1b1218cdb41fe4d5eb8a351a6a1a',1,'cv::cudev::VecTraits< double4 >::elem_type'],['https://docs.opencv.org/4.2.0/d0/d48/structcv_1_1cudev_1_1VecTraits_3_01float_01_4.html#a20a520baad9b1ba4b0043fd67d591375',1,'cv::cudev::VecTraits< float >::elem_type'],['https://docs.opencv.org/4.2.0/dc/d22/structcv_1_1cudev_1_1VecTraits_3_01float1_01_4.html#abdb0ed9ba7085b8273a9bf5046876f37',1,'cv::cudev::VecTraits< float1 >::elem_type'],['https://docs.opencv.org/4.2.0/d9/dfe/structcv_1_1cudev_1_1VecTraits_3_01float2_01_4.html#ac1e680704cc0c279aa6a264a67260278',1,'cv::cudev::VecTraits< float2 >::elem_type'],['https://docs.opencv.org/4.2.0/d9/d1a/structcv_1_1cudev_1_1VecTraits_3_01float3_01_4.html#a8615c9876166a4b225f7beb8a1fbfd54',1,'cv::cudev::VecTraits< float3 >::elem_type'],['https://docs.opencv.org/4.2.0/d9/d9c/structcv_1_1cudev_1_1VecTraits_3_01float4_01_4.html#aec67c43ca0724f2c8087b4152bbbddf4',1,'cv::cudev::VecTraits< float4 >::elem_type'],['https://docs.opencv.org/4.2.0/d7/dc2/structcv_1_1cudev_1_1VecTraits_3_01int1_01_4.html#ae2a66e9f29226d2ae1ae3b6c2ca98bdb',1,'cv::cudev::VecTraits< int1 >::elem_type'],['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1VecTraits_3_01int2_01_4.html#a6ffefa42b2ef82b8bd64bf9235c72aed',1,'cv::cudev::VecTraits< int2 >::elem_type'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1VecTraits_3_01int3_01_4.html#a049c3ba673dfb3bf3499dda849d5b1f6',1,'cv::cudev::VecTraits< int3 >::elem_type'],['https://docs.opencv.org/4.2.0/da/d75/structcv_1_1cudev_1_1VecTraits_3_01int4_01_4.html#a37d864b7348510bfed2d452f013d539f',1,'cv::cudev::VecTraits< int4 >::elem_type'],['https://docs.opencv.org/4.2.0/d4/d43/structcv_1_1cudev_1_1VecTraits_3_01schar_01_4.html#aa666e3390d8986305d36a49f60464870',1,'cv::cudev::VecTraits< schar >::elem_type'],['https://docs.opencv.org/4.2.0/da/df0/structcv_1_1cudev_1_1VecTraits_3_01short_01_4.html#a9e14afe880970abdfa2efcf9025cdd70',1,'cv::cudev::VecTraits< short >::elem_type'],['https://docs.opencv.org/4.2.0/d6/dec/structcv_1_1cudev_1_1VecTraits_3_01short1_01_4.html#a4dbcbdc34e8b6242314e41438b6d3011',1,'cv::cudev::VecTraits< short1 >::elem_type'],['https://docs.opencv.org/4.2.0/dd/d78/structcv_1_1cudev_1_1VecTraits_3_01short2_01_4.html#af178ee1da4fd2af6131c801f5ab299a6',1,'cv::cudev::VecTraits< short2 >::elem_type'],['https://docs.opencv.org/4.2.0/da/d6d/structcv_1_1cudev_1_1VecTraits_3_01short3_01_4.html#a0f1f86cab10a4a32e44ceee7823091cf',1,'cv::cudev::VecTraits< short3 >::elem_type'],['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1VecTraits_3_01short4_01_4.html#a869abf0a265e173209075820afd3521a',1,'cv::cudev::VecTraits< short4 >::elem_type'],['https://docs.opencv.org/4.2.0/df/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar_01_4.html#a86e48a1fe5811c6e01d647417ec7cfc1',1,'cv::cudev::VecTraits< uchar >::elem_type'],['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar1_01_4.html#a1040b3c9e08980e396689816b353b0fd',1,'cv::cudev::VecTraits< uchar1 >::elem_type'],['https://docs.opencv.org/4.2.0/d0/da8/structcv_1_1cudev_1_1VecTraits_3_01uchar2_01_4.html#af9f15baba03ee4ed8b72a654cbd8cd66',1,'cv::cudev::VecTraits< uchar2 >::elem_type'],['https://docs.opencv.org/4.2.0/da/d8a/structcv_1_1cudev_1_1VecTraits_3_01uchar3_01_4.html#a3e6027da33f86bbca52b975df4a243fa',1,'cv::cudev::VecTraits< uchar3 >::elem_type'],['https://docs.opencv.org/4.2.0/d4/dc1/structcv_1_1cudev_1_1VecTraits_3_01uchar4_01_4.html#a2ac3218d628a69d65df544bca71db0bf',1,'cv::cudev::VecTraits< uchar4 >::elem_type'],['https://docs.opencv.org/4.2.0/de/d87/structcv_1_1cudev_1_1VecTraits_3_01uint_01_4.html#ab7bb1d95fba83df980fc384e60ed2e1d',1,'cv::cudev::VecTraits< uint >::elem_type'],['https://docs.opencv.org/4.2.0/de/d41/structcv_1_1cudev_1_1VecTraits_3_01uint1_01_4.html#ac0f81c1abf342ce9bb097884a6c469cb',1,'cv::cudev::VecTraits< uint1 >::elem_type'],['https://docs.opencv.org/4.2.0/d7/d19/structcv_1_1cudev_1_1VecTraits_3_01uint2_01_4.html#a31a0d195dcb1f5c8be121c8eaf1e2c39',1,'cv::cudev::VecTraits< uint2 >::elem_type'],['https://docs.opencv.org/4.2.0/da/d00/structcv_1_1cudev_1_1VecTraits_3_01uint3_01_4.html#a57ffcf892c5f768d16e463f75e21f27d',1,'cv::cudev::VecTraits< uint3 >::elem_type'],['https://docs.opencv.org/4.2.0/dc/d7c/structcv_1_1cudev_1_1VecTraits_3_01uint4_01_4.html#ada40136fe193c5ef632b3f4d7a37db20',1,'cv::cudev::VecTraits< uint4 >::elem_type'],['https://docs.opencv.org/4.2.0/d9/db8/structcv_1_1cudev_1_1VecTraits_3_01ushort_01_4.html#a4a33bdb9c5f3a27735c2c7d31ec05328',1,'cv::cudev::VecTraits< ushort >::elem_type'],['https://docs.opencv.org/4.2.0/da/d76/structcv_1_1cudev_1_1VecTraits_3_01ushort1_01_4.html#a2738bfaa38770a822b2921d9df8c0c41',1,'cv::cudev::VecTraits< ushort1 >::elem_type'],['https://docs.opencv.org/4.2.0/d0/d40/structcv_1_1cudev_1_1VecTraits_3_01ushort2_01_4.html#aff818104d5965a2a6203f9e832c5269a',1,'cv::cudev::VecTraits< ushort2 >::elem_type'],['https://docs.opencv.org/4.2.0/d4/dd7/structcv_1_1cudev_1_1VecTraits_3_01ushort3_01_4.html#a8db03cd2dd35ff34c00679c3f144f961',1,'cv::cudev::VecTraits< ushort3 >::elem_type'],['https://docs.opencv.org/4.2.0/d3/d14/structcv_1_1cudev_1_1VecTraits_3_01ushort4_01_4.html#aec36a3d13a2efd8f44d159d086fb64ec',1,'cv::cudev::VecTraits< ushort4 >::elem_type']]], - ['element_20operations_98',['Per-element Operations',['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html',1,'']]], - ['element_20wise_20absolute_20difference_99',['Element-wise absolute difference',['https://docs.opencv.org/4.2.0/d5/dec/group__core__hal__interface__absdiff.html',1,'']]], - ['element_20wise_20add_20and_20subtract_100',['Element-wise add and subtract',['https://docs.opencv.org/4.2.0/d8/d6f/group__core__hal__interface__addsub.html',1,'']]], - ['element_20wise_20compare_101',['Element-wise compare',['https://docs.opencv.org/4.2.0/d6/dab/group__core__hal__interface__compare.html',1,'']]], - ['element_20wise_20divide_102',['Element-wise divide',['https://docs.opencv.org/4.2.0/dd/d2c/group__core__hal__interface__divide.html',1,'']]], - ['element_20wise_20minimum_20or_20maximum_103',['Element-wise minimum or maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'']]], - ['element_20wise_20multiply_104',['Element-wise multiply',['https://docs.opencv.org/4.2.0/de/db7/group__core__hal__interface__multiply.html',1,'']]], - ['element_20wise_20reciprocial_105',['Element-wise reciprocial',['https://docs.opencv.org/4.2.0/d4/de4/group__core__hal__interface__reciprocial.html',1,'']]], - ['element_20wise_20weighted_20sum_106',['Element-wise weighted sum',['https://docs.opencv.org/4.2.0/da/d9b/group__core__hal__interface__addWeighted.html',1,'']]], - ['element_5farray_5fbuffer_107',['ELEMENT_ARRAY_BUFFER',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a830568a629457171cb07918537ec66beae86acf739ab6ec3ccdc40db15366f672',1,'cv::ogl::Buffer']]], - ['element_5ftype_108',['element_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a7c925143715c359436b453e524dd9fc1',1,'std::auto_ptr::element_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06311.html#a2952524002a6723ff9bec4c5dbee8367',1,'std::pointer_traits::element_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06323.html#ac702e82a55f07abb4e8992a4c9c3d5c1',1,'std::pointer_traits< _Tp * >::element_type']]], - ['elementary_20features_109',['BRIEF (Binary Robust Independent Elementary Features)',['https://docs.opencv.org/4.2.0/dc/d7d/tutorial_py_brief.html',1,'']]], - ['elementtype_110',['ElementType',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1flann_1_1GenericIndex.html#a02a5a5a197e139b8969c505c9a6c9859',1,'cv::flann::GenericIndex']]], - ['elementwise_111',['elementWise',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#aeadefd8cf1e2d0b6734c16d084b1e6e7',1,'cv::MatOp']]], - ['elemsize_112',['elemSize',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#aa012621795cee84b02dd63dee0d2a70b',1,'cv::LineIterator::elemSize'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#abb8c32985f6cb017b926e584c48361dc',1,'cv::MatConstIterator::elemSize'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a7865fed445e49726896502f25d77ca6c',1,'cv::ogl::Buffer::elemSize()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a7e73b4fa94d32e0585564217ebe3fc6c',1,'cv::cuda::GpuMat::elemSize()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a6a79fdf2070ede4fd33fd3abb36d7b8b',1,'cv::cudev::GpuMat_::elemSize()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#af4d2f52deeacd51b5ccd07759123e0f0',1,'cv::cuda::HostMem::elemSize()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aba7a5ef00b22b70668fba575005dfe55',1,'cv::Mat::elemSize()'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a17a22f04a8935c8034f0c4b81b68bb44',1,'cv::gapi::own::Mat::elemSize()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9b1cd8c0b180fde075bc856a476232a6',1,'cv::Mat_::elemSize()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9b1cd8c0b180fde075bc856a476232a6',1,'Mat_< double >::elemSize()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9b1cd8c0b180fde075bc856a476232a6',1,'Mat_< float >::elemSize()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9b1cd8c0b180fde075bc856a476232a6',1,'Mat_< uchar >::elemSize()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9b1cd8c0b180fde075bc856a476232a6',1,'Mat_< unsigned char >::elemSize()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af42f343f4f3d5bc974db1eca57417150',1,'cv::SparseMat::elemSize()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a391f71d1da637a234701f78d7b0cc9a5',1,'cv::UMat::elemSize()']]], - ['elemsize1_113',['elemSize1',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a71e4454b2b0d3e1b4f29c958ab90f28d',1,'cv::ogl::Buffer::elemSize1()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a988831407704239eadc036df1b615de5',1,'cv::cuda::GpuMat::elemSize1()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#aca1348912149f41d5246e3aa2b4c7dce',1,'cv::cudev::GpuMat_::elemSize1()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a350f03863027be4851f1b21ae8514bab',1,'cv::cuda::HostMem::elemSize1()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a9acde8f32d4b294558fb406bc05171bc',1,'cv::Mat::elemSize1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a497f71fadd1274bd6b5c1dfa9421514e',1,'cv::Mat_::elemSize1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a497f71fadd1274bd6b5c1dfa9421514e',1,'Mat_< double >::elemSize1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a497f71fadd1274bd6b5c1dfa9421514e',1,'Mat_< float >::elemSize1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a497f71fadd1274bd6b5c1dfa9421514e',1,'Mat_< uchar >::elemSize1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a497f71fadd1274bd6b5c1dfa9421514e',1,'Mat_< unsigned char >::elemSize1()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a3564e3c77b19ac1104dbe924973dd288',1,'cv::SparseMat::elemSize1()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a318efa69d05f7b4c61488a8ce5125247',1,'cv::UMat::elemSize1()']]], - ['ellint_5f1_114',['ellint_1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gae6b3df5556f38a7d72f9b4457d856f9c',1,'std::ellint_1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga7d289fce6de2d3ac3abfcecf4f419396',1,'std::tr1::ellint_1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gae6b3df5556f38a7d72f9b4457d856f9c',1,'ellint_1(_Tp __k, _Tpp __phi)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga7d289fce6de2d3ac3abfcecf4f419396',1,'ellint_1(_Tp __k, _Tpp __phi)(Global Namespace)']]], - ['ellint_5f1f_115',['ellint_1f',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga308d23d70f4b5e848eb7a4173628ef3b',1,'std::ellint_1f()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga308d23d70f4b5e848eb7a4173628ef3b',1,'ellint_1f()(Global Namespace)']]], - ['ellint_5f1l_116',['ellint_1l',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga795383fa51e02351000b410b478d824f',1,'std::ellint_1l()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga795383fa51e02351000b410b478d824f',1,'ellint_1l()(Global Namespace)']]], - ['ellint_5f2_117',['ellint_2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gad6dd71db2b3f90d24ff49bf8cf37bc37',1,'std::ellint_2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gaca3de93877d9d195863279ef8e2d2b83',1,'std::tr1::ellint_2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gad6dd71db2b3f90d24ff49bf8cf37bc37',1,'ellint_2(_Tp __k, _Tpp __phi)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gaca3de93877d9d195863279ef8e2d2b83',1,'ellint_2(_Tp __k, _Tpp __phi)(Global Namespace)']]], - ['ellint_5f2f_118',['ellint_2f',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga594a730163c6228c75b152462700062b',1,'std::ellint_2f()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga594a730163c6228c75b152462700062b',1,'ellint_2f()(Global Namespace)']]], - ['ellint_5f2l_119',['ellint_2l',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga5c791332d374a809d8ca16c69a1a30f5',1,'std::ellint_2l()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga5c791332d374a809d8ca16c69a1a30f5',1,'ellint_2l()(Global Namespace)']]], - ['ellint_5f3_120',['ellint_3',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga20832e3a67d25cc3d415cafc88019ac3',1,'std::ellint_3()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga55963b25d9fb39d84193ca03cd6772d4',1,'std::tr1::ellint_3()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga20832e3a67d25cc3d415cafc88019ac3',1,'ellint_3(_Tp __k, _Tpn __nu, _Tpp __phi)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga55963b25d9fb39d84193ca03cd6772d4',1,'ellint_3(_Tp __k, _Tpn __nu, _Tpp __phi)(Global Namespace)']]], - ['ellint_5f3f_121',['ellint_3f',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1a80bd2c15bc9fbecda2630a9e9409e7',1,'std::ellint_3f()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1a80bd2c15bc9fbecda2630a9e9409e7',1,'ellint_3f()(Global Namespace)']]], - ['ellint_5f3l_122',['ellint_3l',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaa8c0e5864df8769021a7f3e21a30c5d2',1,'std::ellint_3l()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaa8c0e5864df8769021a7f3e21a30c5d2',1,'ellint_3l()(Global Namespace)']]], - ['ellipse_123',['ellipse',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga28b2267d35786f5f890ca167236cbc69',1,'cv::ellipse(InputOutputArray img, Point center, Size axes, double angle, double startAngle, double endAngle, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga57be400d8eff22fb946ae90c8e7441f9',1,'cv::ellipse(InputOutputArray img, const RotatedRect &box, const Scalar &color, int thickness=1, int lineType=LINE_8)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga28b2267d35786f5f890ca167236cbc69',1,'ellipse(InputOutputArray img, Point center, Size axes, double angle, double startAngle, double endAngle, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga57be400d8eff22fb946ae90c8e7441f9',1,'ellipse(InputOutputArray img, const RotatedRect &box, const Scalar &color, int thickness=1, int lineType=LINE_8)(Global Namespace)']]], - ['ellipse2poly_124',['ellipse2Poly',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga727a72a3f6a625a2ae035f957c61051f',1,'cv::ellipse2Poly(Point center, Size axes, int angle, int arcStart, int arcEnd, int delta, std::vector< Point > &pts)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga3d9494192ef3a9fd07f02e2377897faf',1,'cv::ellipse2Poly(Point2d center, Size2d axes, int angle, int arcStart, int arcEnd, int delta, std::vector< Point2d > &pts)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga727a72a3f6a625a2ae035f957c61051f',1,'ellipse2Poly(Point center, Size axes, int angle, int arcStart, int arcEnd, int delta, std::vector< Point > &pts)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga3d9494192ef3a9fd07f02e2377897faf',1,'ellipse2Poly(Point2d center, Size2d axes, int angle, int arcStart, int arcEnd, int delta, std::vector< Point2d > &pts)(Global Namespace)']]], - ['ellipses_20for_20contours_125',['Creating Bounding rotated boxes and ellipses for contours',['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'']]], - ['elliptic_5fkeypoint_126',['Elliptic_KeyPoint',['https://docs.opencv.org/4.2.0/d2/d71/classcv_1_1xfeatures2d_1_1Elliptic__KeyPoint.html',1,'cv::xfeatures2d::Elliptic_KeyPoint'],['https://docs.opencv.org/4.2.0/d2/d71/classcv_1_1xfeatures2d_1_1Elliptic__KeyPoint.html#a93cdc46292806df181169af8703e9cd6',1,'cv::xfeatures2d::Elliptic_KeyPoint::Elliptic_KeyPoint()'],['https://docs.opencv.org/4.2.0/d2/d71/classcv_1_1xfeatures2d_1_1Elliptic__KeyPoint.html#a50a7573985031521a52b3dbaf7048b05',1,'cv::xfeatures2d::Elliptic_KeyPoint::Elliptic_KeyPoint(Point2f pt, float angle, Size axes, float size, float si)']]], - ['elname_127',['elname',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae2c1bb9453394d0c8a5f07514eccf94b',1,'cv::FileStorage']]], - ['eltwiselayer_128',['EltwiseLayer',['https://docs.opencv.org/4.2.0/d6/d6a/classcv_1_1dnn_1_1EltwiseLayer.html',1,'cv::dnn']]], - ['elulayer_129',['ELULayer',['https://docs.opencv.org/4.2.0/df/da5/classcv_1_1dnn_1_1ELULayer.html',1,'cv::dnn']]], - ['em_130',['EM',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html',1,'cv::ml']]], - ['emd_131',['EMD',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga902b8e60cc7075c8947345489221e0e0',1,'cv::EMD()'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga902b8e60cc7075c8947345489221e0e0',1,'EMD()(Global Namespace)']]], - ['emdhistogramcostextractor_132',['EMDHistogramCostExtractor',['https://docs.opencv.org/4.2.0/d0/d1c/classcv_1_1EMDHistogramCostExtractor.html',1,'cv']]], - ['emdl1_133',['EMDL1',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gacb101cb63eb94a4a6a61d60e487b18e6',1,'cv::EMDL1()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gacb101cb63eb94a4a6a61d60e487b18e6',1,'EMDL1(InputArray signature1, InputArray signature2)(Global Namespace)']]], - ['emdl1_2ehpp_134',['emdL1.hpp',['https://docs.opencv.org/4.2.0/dd/dcb/emdL1_8hpp.html',1,'']]], - ['emdl1histogramcostextractor_135',['EMDL1HistogramCostExtractor',['https://docs.opencv.org/4.2.0/da/d8e/classcv_1_1EMDL1HistogramCostExtractor.html',1,'cv']]], - ['emergencystop_136',['emergencyStop',['../namespacerobot.html#a902b5dd26574990fe0a8a9d3c4e7a97e',1,'robot']]], - ['emergencystopmotors_137',['emergencyStopMotors',['../namespacecan_1_1motor.html#adc2d7e351335d09610a09780cbed9bde',1,'can::motor']]], - ['emission_5fp_138',['emission_p',['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a9bd0273e8426024953f910cb6bb730be',1,'cv::text::OCRBeamSearchDecoder::emission_p'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a6980a7f7e5a1989b1ab2a5f5fef001a5',1,'cv::text::OCRHMMDecoder::emission_p']]], - ['emplace_139',['emplace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a3ea67e3e7fc5c84e92d9868bb57ae05a',1,'deque< _StateSeqT >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a1b89836dea3d2950a96e485677fe3c30',1,'list< __inp, __rebind_inp >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'match_results< _Bi_iter >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a3ea67e3e7fc5c84e92d9868bb57ae05a',1,'std::deque::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a1b89836dea3d2950a96e485677fe3c30',1,'std::list::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#adbdeb769358f26cc1f0124f5c53df0eb',1,'std::map::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'std::match_results::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a18dc0fd47da3fff883f3c1eab8f71908',1,'std::multimap::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a12431fd574451b7c1e677d09f6d2ef46',1,'std::multiset::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af16da8812db504af3bbf8a682de754d6',1,'std::set::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aa2c22cafc2b6f068358049c8fdb7bda0',1,'std::unordered_map::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a4d00357a4ca15a9cdffa4aef992859c8',1,'std::unordered_multimap::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a31747dab6f248961de2668f292a18565',1,'std::unordered_multiset::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae5af2f1d8d0746c3db3357561a73c6f7',1,'std::unordered_set::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'std::vector::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aa2c22cafc2b6f068358049c8fdb7bda0',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< __diff_type >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _CharClassT >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _CharT >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _Cmpt >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _Node *, _Nodeptr_Alloc >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _RealType >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _State< _TraitsT::char_type > >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _StringT >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< block_type, allocator_type >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< Catalog_info * >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< double >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< int >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< result_type >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< size_t >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< std::pair< _BiIter, int > >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< std::pair< _StateIdT, std::vector > >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< std::pair< _StrTransT, _StrTransT > >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< sub_match< _Bi_iter >, _Alloc >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< sub_match< _BiIter >, _Alloc >::emplace()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac479e609cbd03948bd3e85fb441b66e5.html#ac479e609cbd03948bd3e85fb441b66e5',1,'nlohmann::basic_json::emplace()'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a38834c948b844033caa7d5c76fee5866.html#a38834c948b844033caa7d5c76fee5866',1,'nlohmann::ordered_map::emplace()']]], - ['emplace_5fafter_140',['emplace_after',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a5fd1e68be8454830cea449ad8114cf3d',1,'std::forward_list']]], - ['emplace_5fback_141',['emplace_back',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a15c0a5db4fb12d49433801bbe6436bfb.html#a15c0a5db4fb12d49433801bbe6436bfb',1,'nlohmann::basic_json']]], - ['emplace_5ffront_142',['emplace_front',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#abea57251bbfc9d77cd5ee8ae2bcc52cc',1,'std::forward_list']]], - ['emplace_5fhint_143',['emplace_hint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a01e3c11364a0f9f6304581d1dc69bd34',1,'std::map::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a89892e96cd8b74074e5d83f9d30005c6',1,'std::multimap::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a18406be2849c2b0f4786452e6bd860f5',1,'std::multiset::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ae4eb02463d17b44a49e6d916d05548fe',1,'std::set::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af36454c8cd5831988060bdf85a4d4d6e',1,'std::unordered_map::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af7f415a309a77497c41538b60d358fed',1,'std::unordered_multimap::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a81c1d4a9ff7f0173466deb652ab4f10b',1,'std::unordered_multiset::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a8d66aca929c29059391648628f2e250b',1,'std::unordered_set::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af36454c8cd5831988060bdf85a4d4d6e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::emplace_hint()']]], + ['eigen_20and_20multi_20threading_34',['Eigen and multi-threading',['https://eigen.tuxfamily.org/dox/TopicMultiThreading.html',1,'']]], + ['eigen_20in_20cmake_20projects_35',['Using Eigen in CMake Projects',['https://eigen.tuxfamily.org/dox/TopicCMakeGuide.html',1,'']]], + ['eigen_20in_20cuda_20kernels_36',['Using Eigen in CUDA kernels',['https://eigen.tuxfamily.org/dox/TopicCUDA.html',1,'']]], + ['eigen_20members_37',['Structures Having Eigen Members',['https://eigen.tuxfamily.org/dox/group__TopicStructHavingEigenMembers.html',1,'']]], + ['eigen_20objects_38',['Fixed-size vectorizable Eigen objects',['https://eigen.tuxfamily.org/dox/group__TopicFixedSizeVectorizable.html',1,'']]], + ['eigen_20objects_20by_20value_20to_20functions_39',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], + ['eigen_20on_20a_20simple_20example_40',['What happens inside Eigen, on a simple example',['https://eigen.tuxfamily.org/dox/TopicInsideEigenExample.html',1,'']]], + ['eigen_20support_41',['Eigen support',['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html',1,'']]], + ['eigen_20types_20as_20parameters_42',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], + ['eigen_2ehpp_43',['eigen.hpp',['https://docs.opencv.org/4.2.0/d3/ddd/eigen_8hpp.html',1,'']]], + ['eigen2cv_44',['eigen2cv',['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gabf167b4c7d0dbed6bc3ae6e3fda25734',1,'cv::eigen2cv(const Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gac9fd7b6d6cc93f82b77da378f9565be3',1,'cv::eigen2cv(const Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &src, Matx< _Tp, _rows, _cols > &dst)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gabf167b4c7d0dbed6bc3ae6e3fda25734',1,'eigen2cv(const Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html#gac9fd7b6d6cc93f82b77da378f9565be3',1,'eigen2cv(const Eigen::Matrix< _Tp, _rows, _cols, _options, _maxRows, _maxCols > &src, Matx< _Tp, _rows, _cols > &dst)(Global Namespace)']]], + ['eigen_3a_3adoxygen_45',['doxygen',['https://eigen.tuxfamily.org/dox/structEigen_1_1doxygen_1_1dense__xpr__base__dispatcher.html',1,'Eigen']]], + ['eigen_3a_3aindexing_46',['indexing',['https://eigen.tuxfamily.org/dox/namespaceEigen_1_1indexing.html',1,'Eigen']]], + ['eigen_3a_3amap_47',['Eigen::Map',['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a44523f8b49c90154f6195c6f04666499',1,'Eigen::PlainObjectBase::Map'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ade83ff019d359dc837c0f4b697eb5027',1,'Eigen::PlainObjectBase::Map'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#a52f7d6b523cce948a7804a7aeef210f9',1,'Eigen::PlainObjectBase::Map']]], + ['eigen_3a_3asimplicialcholeskybase_48',['SimplicialCholeskyBase',['https://eigen.tuxfamily.org/dox/structEigen_1_1SimplicialCholeskyBase_1_1keep__diag.html',1,'Eigen']]], + ['eigen_3a_3asymbolic_49',['symbolic',['https://eigen.tuxfamily.org/dox/namespaceEigen_1_1symbolic.html',1,'Eigen']]], + ['eigen_5fexpr_5fbinaryop_5fscalar_5freturn_5ftype_50',['EIGEN_EXPR_BINARYOP_SCALAR_RETURN_TYPE',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ab4950605c14c530c2d56c75f0e253d10',1,'Eigen::AlignedBox']]], + ['eigen_5fmake_5faligned_5foperator_5fnew_5fif_5fvectorizable_5ffixed_5fsize_51',['EIGEN_MAKE_ALIGNED_OPERATOR_NEW_IF_VECTORIZABLE_FIXED_SIZE',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a30c94c2156e9345f4bdb6cc9661e275b',1,'Eigen::Transform']]], + ['eigenbase_52',['EigenBase',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'Eigen']]], + ['eigenbase_3c_20bandmatrix_3c_20_5fscalar_2c_20rows_2c_20cols_2c_20supers_2c_20subs_2c_20options_20_3e_20_3e_53',['EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20bandmatrix_3c_20scalar_2c_20rows_2c_20cols_2c_20supers_2c_20subs_2c_20options_20_3e_20_3e_54',['EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20block_3c_20xprtype_2c_20blockrows_2c_20blockcols_2c_20innerpanel_20_3e_20_3e_55',['EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20block_3c_20xprtype_2c_20blockrows_2c_20blockcols_2c_20true_20_3e_20_3e_56',['EigenBase< Block< XprType, BlockRows, BlockCols, true > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20colpivhouseholderqr_3c_20_5fmatrixtype_20_3e_20_3e_57',['EigenBase< ColPivHouseholderQR< _MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20colpivhouseholderqr_3c_20matrixtype_20_3e_20_3e_58',['EigenBase< ColPivHouseholderQR< MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20completeorthogonaldecomposition_3c_20_5fmatrixtype_20_3e_20_3e_59',['EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20cwisebinaryop_3c_20binaryop_2c_20lhs_2c_20rhs_20_3e_20_3e_60',['EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20fullpivhouseholderqr_3c_20_5fmatrixtype_20_3e_20_3e_61',['EigenBase< FullPivHouseholderQR< _MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20fullpivlu_3c_20_5fmatrixtype_20_3e_20_3e_62',['EigenBase< FullPivLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20householderqr_3c_20_5fmatrixtype_20_3e_20_3e_63',['EigenBase< HouseholderQR< _MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20householdersequence_3c_20vectorstype_2c_20coeffstype_2c_20side_20_3e_20_3e_64',['EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20inverse_3c_20permutationtype_20_3e_20_3e_65',['EigenBase< Inverse< PermutationType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20ldlt_3c_20_5fmatrixtype_2c_20_5fuplo_20_3e_20_3e_66',['EigenBase< LDLT< _MatrixType, _UpLo > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20llt_3c_20_5fmatrixtype_2c_20_5fuplo_20_3e_20_3e_67',['EigenBase< LLT< _MatrixType, _UpLo > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20map_3c_20permutationmatrix_3c_20sizeatcompiletime_2c_20maxsizeatcompiletime_2c_20_5fstorageindex_20_3e_2c_20_5fpacketaccess_20_3e_20_3e_68',['EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20partialpivlu_3c_20_5fmatrixtype_20_3e_20_3e_69',['EigenBase< PartialPivLU< _MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20permutationmatrix_3c_20sizeatcompiletime_2c_20maxsizeatcompiletime_2c_20_5fstorageindex_20_3e_20_3e_70',['EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20permutationmatrix_3c_20sizeatcompiletime_2c_20maxsizeatcompiletime_2c_20storageindex_20_3e_20_3e_71',['EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20permutationwrapper_3c_20_5findicestype_20_3e_20_3e_72',['EigenBase< PermutationWrapper< _IndicesType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20selfadjointview_3c_20_5fmatrixtype_2c_20uplo_20_3e_20_3e_73',['EigenBase< SelfAdjointView< _MatrixType, UpLo > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20selfadjointview_3c_20const_20derived_2c_20uplo_20_3e_20_3e_74',['EigenBase< SelfAdjointView< const Derived, UpLo > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20sparseselfadjointview_3c_20const_20derived_2c_20_5fmode_20_3e_20_3e_75',['EigenBase< SparseSelfAdjointView< const Derived, _Mode > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20sparseselfadjointview_3c_20matrixtype_2c_20_5fmode_20_3e_20_3e_76',['EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20sparsesymmetricpermutationproduct_3c_20matrixtype_2c_20mode_20_3e_20_3e_77',['EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20svdbase_3c_20derived_20_3e_20_3e_78',['EigenBase< SVDBase< Derived > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20svdbase_3c_20jacobisvd_3c_20_5fmatrixtype_2c_20qrpreconditioner_20_3e_20_3e_20_3e_79',['EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20transpose_3c_20matrixtype_20_3e_20_3e_80',['EigenBase< Transpose< MatrixType > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20triangularview_3c_20_5fmatrixtype_2c_20_5fmode_20_3e_20_3e_81',['EigenBase< TriangularView< _MatrixType, _Mode > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenbase_3c_20triangularview_3c_20matrixtype_2c_20mode_20_3e_20_3e_82',['EigenBase< TriangularView< MatrixType, Mode > >',['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html',1,'']]], + ['eigenfacerecognizer_83',['EigenFaceRecognizer',['https://docs.opencv.org/4.2.0/dd/d7c/classcv_1_1face_1_1EigenFaceRecognizer.html',1,'cv::face']]], + ['eigennonsymmetric_84',['eigenNonSymmetric',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf51987e03cac8d171fbd2b327cf966f6',1,'cv::eigenNonSymmetric()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf51987e03cac8d171fbd2b327cf966f6',1,'eigenNonSymmetric()(Global Namespace)']]], + ['eigensolver_85',['EigenSolver',['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html',1,'Eigen::EigenSolver< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a3af22d721a6401365881b2ef252d26aa',1,'Eigen::EigenSolver::EigenSolver()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a7e8ab3d89ea525af5f27f1a8e805fae1',1,'Eigen::EigenSolver::EigenSolver(const EigenBase< InputType > &matrix, bool computeEigenvectors=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#aa4edf56ecc178b277b75c13a2ca1089f',1,'Eigen::EigenSolver::EigenSolver(Index size)']]], + ['eigenvalues_86',['eigenvalues',['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a1c9d34c02df49120474a4a366b971303',1,'cv::PCA::eigenvalues'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a09eeb511758f419c8d079489e2c5c939',1,'cv::LDA::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a10c25c7620e7faedcd39991cce3a757b',1,'Eigen::ComplexEigenSolver::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a114189009e42f5e03372a7a3dfa33b97',1,'Eigen::EigenSolver::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#a62f01cd78271efd5e39bcb24e0fe1a58',1,'Eigen::GeneralizedEigenSolver::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a30430fa3d5b4e74d312fd4f502ac984d',1,'Eigen::MatrixBase::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a30430fa3d5b4e74d312fd4f502ac984d',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a30430fa3d5b4e74d312fd4f502ac984d',1,'MatrixBase< Solve< Decomposition, RhsType > >::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a3df8721abcc71132f7f02bf9dfe78e41',1,'Eigen::SelfAdjointEigenSolver::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad4f34424b4ea12de9bbc5623cb938b4f',1,'Eigen::SelfAdjointView::eigenvalues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad4f34424b4ea12de9bbc5623cb938b4f',1,'SelfAdjointView< const Derived, UpLo >::eigenvalues()']]], + ['eigenvalues_20module_87',['Eigenvalues module',['https://eigen.tuxfamily.org/dox/group__Eigenvalues__Module.html',1,'']]], + ['eigenvaluesonly_88',['EigenvaluesOnly',['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9afd06633f270207c373875fd7ca03e906',1,'Eigen::EigenvaluesOnly'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggae3e239fb70022eb8747994cf5d68b4a9afd06633f270207c373875fd7ca03e906',1,'EigenvaluesOnly(Global Namespace)']]], + ['eigenvaluesreturntype_89',['EigenvaluesReturnType',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a8ae92703d920130b38a383f8b165146c',1,'Eigen::SelfAdjointView::EigenvaluesReturnType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a8ae92703d920130b38a383f8b165146c',1,'SelfAdjointView< const Derived, UpLo >::EigenvaluesReturnType']]], + ['eigenvaluetype_90',['EigenvalueType',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#ad3a663b1ff5200a098dabbbf9b7162b1',1,'Eigen::ComplexEigenSolver::EigenvalueType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#adc446bcb60572758fa64515f2825db62',1,'Eigen::EigenSolver::EigenvalueType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#ad59af178acc401f1bc4e330ef80f286d',1,'Eigen::GeneralizedEigenSolver::EigenvalueType']]], + ['eigenvectors_91',['eigenvectors',['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a8fed85cf5f9d8bb9b17f031398cb74a0',1,'cv::PCA::eigenvectors'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a70ef2afa53f4eb93b4b98a8e359cc628',1,'cv::LDA::eigenvectors()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a3aa5e27800349990778da8fa532c1270',1,'Eigen::ComplexEigenSolver::eigenvectors()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#a66288022802172e3ee059283b26201d7',1,'Eigen::EigenSolver::eigenvectors()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#a229c4c26d87c5d2663cd3cc8a4c68266',1,'Eigen::SelfAdjointEigenSolver::eigenvectors()']]], + ['eigenvectorstype_92',['EigenvectorsType',['https://eigen.tuxfamily.org/dox/classEigen_1_1EigenSolver.html#aa140354e2f7d5ce34c6488c39e19f2c2',1,'Eigen::EigenSolver::EigenvectorsType'],['https://eigen.tuxfamily.org/dox/classEigen_1_1GeneralizedEigenSolver.html#afffec018dbb2d87b4c09b6acecbb79cd',1,'Eigen::GeneralizedEigenSolver::EigenvectorsType']]], + ['eigenvectortype_93',['EigenvectorType',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a67cd4d20590abfd86b2639c4c8ea3dd6',1,'Eigen::ComplexEigenSolver']]], + ['elapsedtime_94',['elapsedTime',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#a871ed8b4c5f721f4898e3c407d781a2c',1,'cv::cuda::Event::elapsedTime()'],['../classutil_1_1ScopedTimer.html#a8b5106706ff6007114bf545852b2b5cc',1,'util::ScopedTimer::elapsedTime()']]], + ['elem_95',['elem',['https://docs.opencv.org/4.2.0/dd/dbd/structcv_1_1datasets_1_1pose.html#a8140e9c34dc6a750d75c61f70d8333ed',1,'cv::datasets::pose']]], + ['elem_5ftype_96',['elem_type',['https://docs.opencv.org/4.2.0/dc/df8/structcv_1_1cudev_1_1VecTraits_3_01char1_01_4.html#a921ebef7a08fc241e001af0342271bbc',1,'cv::cudev::VecTraits< char1 >::elem_type'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1cudev_1_1VecTraits_3_01char2_01_4.html#ac96d012dba5d1ae71ee2909c7b11ba69',1,'cv::cudev::VecTraits< char2 >::elem_type'],['https://docs.opencv.org/4.2.0/df/de4/structcv_1_1cudev_1_1VecTraits_3_01char3_01_4.html#a4b3baea99f1f00df348f7e8f09e4ffd9',1,'cv::cudev::VecTraits< char3 >::elem_type'],['https://docs.opencv.org/4.2.0/dc/df6/structcv_1_1cudev_1_1VecTraits_3_01char4_01_4.html#ab979cfebcea5d7105ee1bdfaa4c21ae9',1,'cv::cudev::VecTraits< char4 >::elem_type'],['https://docs.opencv.org/4.2.0/d1/d4e/structcv_1_1cudev_1_1VecTraits_3_01double_01_4.html#ae82eed5fee383d5d0bd280262e5c9d3e',1,'cv::cudev::VecTraits< double >::elem_type'],['https://docs.opencv.org/4.2.0/d1/de1/structcv_1_1cudev_1_1VecTraits_3_01double1_01_4.html#afa69e1110e0e456a411664e6f97cfc78',1,'cv::cudev::VecTraits< double1 >::elem_type'],['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1VecTraits_3_01double2_01_4.html#a4d694688056736966effd57a68ca33a0',1,'cv::cudev::VecTraits< double2 >::elem_type'],['https://docs.opencv.org/4.2.0/d5/d24/structcv_1_1cudev_1_1VecTraits_3_01double3_01_4.html#a2e59a7457ad0d503cb268cfd2474f4a1',1,'cv::cudev::VecTraits< double3 >::elem_type'],['https://docs.opencv.org/4.2.0/d1/d5d/structcv_1_1cudev_1_1VecTraits_3_01double4_01_4.html#a01ad1b1218cdb41fe4d5eb8a351a6a1a',1,'cv::cudev::VecTraits< double4 >::elem_type'],['https://docs.opencv.org/4.2.0/d0/d48/structcv_1_1cudev_1_1VecTraits_3_01float_01_4.html#a20a520baad9b1ba4b0043fd67d591375',1,'cv::cudev::VecTraits< float >::elem_type'],['https://docs.opencv.org/4.2.0/dc/d22/structcv_1_1cudev_1_1VecTraits_3_01float1_01_4.html#abdb0ed9ba7085b8273a9bf5046876f37',1,'cv::cudev::VecTraits< float1 >::elem_type'],['https://docs.opencv.org/4.2.0/d9/dfe/structcv_1_1cudev_1_1VecTraits_3_01float2_01_4.html#ac1e680704cc0c279aa6a264a67260278',1,'cv::cudev::VecTraits< float2 >::elem_type'],['https://docs.opencv.org/4.2.0/d9/d1a/structcv_1_1cudev_1_1VecTraits_3_01float3_01_4.html#a8615c9876166a4b225f7beb8a1fbfd54',1,'cv::cudev::VecTraits< float3 >::elem_type'],['https://docs.opencv.org/4.2.0/d9/d9c/structcv_1_1cudev_1_1VecTraits_3_01float4_01_4.html#aec67c43ca0724f2c8087b4152bbbddf4',1,'cv::cudev::VecTraits< float4 >::elem_type'],['https://docs.opencv.org/4.2.0/d7/dc2/structcv_1_1cudev_1_1VecTraits_3_01int1_01_4.html#ae2a66e9f29226d2ae1ae3b6c2ca98bdb',1,'cv::cudev::VecTraits< int1 >::elem_type'],['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1VecTraits_3_01int2_01_4.html#a6ffefa42b2ef82b8bd64bf9235c72aed',1,'cv::cudev::VecTraits< int2 >::elem_type'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1VecTraits_3_01int3_01_4.html#a049c3ba673dfb3bf3499dda849d5b1f6',1,'cv::cudev::VecTraits< int3 >::elem_type'],['https://docs.opencv.org/4.2.0/da/d75/structcv_1_1cudev_1_1VecTraits_3_01int4_01_4.html#a37d864b7348510bfed2d452f013d539f',1,'cv::cudev::VecTraits< int4 >::elem_type'],['https://docs.opencv.org/4.2.0/d4/d43/structcv_1_1cudev_1_1VecTraits_3_01schar_01_4.html#aa666e3390d8986305d36a49f60464870',1,'cv::cudev::VecTraits< schar >::elem_type'],['https://docs.opencv.org/4.2.0/da/df0/structcv_1_1cudev_1_1VecTraits_3_01short_01_4.html#a9e14afe880970abdfa2efcf9025cdd70',1,'cv::cudev::VecTraits< short >::elem_type'],['https://docs.opencv.org/4.2.0/d6/dec/structcv_1_1cudev_1_1VecTraits_3_01short1_01_4.html#a4dbcbdc34e8b6242314e41438b6d3011',1,'cv::cudev::VecTraits< short1 >::elem_type'],['https://docs.opencv.org/4.2.0/dd/d78/structcv_1_1cudev_1_1VecTraits_3_01short2_01_4.html#af178ee1da4fd2af6131c801f5ab299a6',1,'cv::cudev::VecTraits< short2 >::elem_type'],['https://docs.opencv.org/4.2.0/da/d6d/structcv_1_1cudev_1_1VecTraits_3_01short3_01_4.html#a0f1f86cab10a4a32e44ceee7823091cf',1,'cv::cudev::VecTraits< short3 >::elem_type'],['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1VecTraits_3_01short4_01_4.html#a869abf0a265e173209075820afd3521a',1,'cv::cudev::VecTraits< short4 >::elem_type'],['https://docs.opencv.org/4.2.0/df/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar_01_4.html#a86e48a1fe5811c6e01d647417ec7cfc1',1,'cv::cudev::VecTraits< uchar >::elem_type'],['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar1_01_4.html#a1040b3c9e08980e396689816b353b0fd',1,'cv::cudev::VecTraits< uchar1 >::elem_type'],['https://docs.opencv.org/4.2.0/d0/da8/structcv_1_1cudev_1_1VecTraits_3_01uchar2_01_4.html#af9f15baba03ee4ed8b72a654cbd8cd66',1,'cv::cudev::VecTraits< uchar2 >::elem_type'],['https://docs.opencv.org/4.2.0/da/d8a/structcv_1_1cudev_1_1VecTraits_3_01uchar3_01_4.html#a3e6027da33f86bbca52b975df4a243fa',1,'cv::cudev::VecTraits< uchar3 >::elem_type'],['https://docs.opencv.org/4.2.0/d4/dc1/structcv_1_1cudev_1_1VecTraits_3_01uchar4_01_4.html#a2ac3218d628a69d65df544bca71db0bf',1,'cv::cudev::VecTraits< uchar4 >::elem_type'],['https://docs.opencv.org/4.2.0/de/d87/structcv_1_1cudev_1_1VecTraits_3_01uint_01_4.html#ab7bb1d95fba83df980fc384e60ed2e1d',1,'cv::cudev::VecTraits< uint >::elem_type'],['https://docs.opencv.org/4.2.0/de/d41/structcv_1_1cudev_1_1VecTraits_3_01uint1_01_4.html#ac0f81c1abf342ce9bb097884a6c469cb',1,'cv::cudev::VecTraits< uint1 >::elem_type'],['https://docs.opencv.org/4.2.0/d7/d19/structcv_1_1cudev_1_1VecTraits_3_01uint2_01_4.html#a31a0d195dcb1f5c8be121c8eaf1e2c39',1,'cv::cudev::VecTraits< uint2 >::elem_type'],['https://docs.opencv.org/4.2.0/da/d00/structcv_1_1cudev_1_1VecTraits_3_01uint3_01_4.html#a57ffcf892c5f768d16e463f75e21f27d',1,'cv::cudev::VecTraits< uint3 >::elem_type'],['https://docs.opencv.org/4.2.0/dc/d7c/structcv_1_1cudev_1_1VecTraits_3_01uint4_01_4.html#ada40136fe193c5ef632b3f4d7a37db20',1,'cv::cudev::VecTraits< uint4 >::elem_type'],['https://docs.opencv.org/4.2.0/d9/db8/structcv_1_1cudev_1_1VecTraits_3_01ushort_01_4.html#a4a33bdb9c5f3a27735c2c7d31ec05328',1,'cv::cudev::VecTraits< ushort >::elem_type'],['https://docs.opencv.org/4.2.0/da/d76/structcv_1_1cudev_1_1VecTraits_3_01ushort1_01_4.html#a2738bfaa38770a822b2921d9df8c0c41',1,'cv::cudev::VecTraits< ushort1 >::elem_type'],['https://docs.opencv.org/4.2.0/d0/d40/structcv_1_1cudev_1_1VecTraits_3_01ushort2_01_4.html#aff818104d5965a2a6203f9e832c5269a',1,'cv::cudev::VecTraits< ushort2 >::elem_type'],['https://docs.opencv.org/4.2.0/d4/dd7/structcv_1_1cudev_1_1VecTraits_3_01ushort3_01_4.html#a8db03cd2dd35ff34c00679c3f144f961',1,'cv::cudev::VecTraits< ushort3 >::elem_type'],['https://docs.opencv.org/4.2.0/d3/d14/structcv_1_1cudev_1_1VecTraits_3_01ushort4_01_4.html#aec36a3d13a2efd8f44d159d086fb64ec',1,'cv::cudev::VecTraits< ushort4 >::elem_type']]], + ['element_20operations_97',['Per-element Operations',['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html',1,'']]], + ['element_20wise_20absolute_20difference_98',['Element-wise absolute difference',['https://docs.opencv.org/4.2.0/d5/dec/group__core__hal__interface__absdiff.html',1,'']]], + ['element_20wise_20add_20and_20subtract_99',['Element-wise add and subtract',['https://docs.opencv.org/4.2.0/d8/d6f/group__core__hal__interface__addsub.html',1,'']]], + ['element_20wise_20compare_100',['Element-wise compare',['https://docs.opencv.org/4.2.0/d6/dab/group__core__hal__interface__compare.html',1,'']]], + ['element_20wise_20divide_101',['Element-wise divide',['https://docs.opencv.org/4.2.0/dd/d2c/group__core__hal__interface__divide.html',1,'']]], + ['element_20wise_20minimum_20or_20maximum_102',['Element-wise minimum or maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'']]], + ['element_20wise_20multiply_103',['Element-wise multiply',['https://docs.opencv.org/4.2.0/de/db7/group__core__hal__interface__multiply.html',1,'']]], + ['element_20wise_20reciprocial_104',['Element-wise reciprocial',['https://docs.opencv.org/4.2.0/d4/de4/group__core__hal__interface__reciprocial.html',1,'']]], + ['element_20wise_20weighted_20sum_105',['Element-wise weighted sum',['https://docs.opencv.org/4.2.0/da/d9b/group__core__hal__interface__addWeighted.html',1,'']]], + ['element_5farray_5fbuffer_106',['ELEMENT_ARRAY_BUFFER',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a830568a629457171cb07918537ec66beae86acf739ab6ec3ccdc40db15366f672',1,'cv::ogl::Buffer']]], + ['element_5ftype_107',['element_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a7c925143715c359436b453e524dd9fc1',1,'std::auto_ptr::element_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06311.html#a2952524002a6723ff9bec4c5dbee8367',1,'std::pointer_traits::element_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06323.html#ac702e82a55f07abb4e8992a4c9c3d5c1',1,'std::pointer_traits< _Tp * >::element_type']]], + ['elementary_20features_108',['BRIEF (Binary Robust Independent Elementary Features)',['https://docs.opencv.org/4.2.0/dc/d7d/tutorial_py_brief.html',1,'']]], + ['elementtype_109',['ElementType',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1flann_1_1GenericIndex.html#a02a5a5a197e139b8969c505c9a6c9859',1,'cv::flann::GenericIndex']]], + ['elementwise_110',['elementWise',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#aeadefd8cf1e2d0b6734c16d084b1e6e7',1,'cv::MatOp']]], + ['elemsize_111',['elemSize',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#aa012621795cee84b02dd63dee0d2a70b',1,'cv::LineIterator::elemSize'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#abb8c32985f6cb017b926e584c48361dc',1,'cv::MatConstIterator::elemSize'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a7865fed445e49726896502f25d77ca6c',1,'cv::ogl::Buffer::elemSize()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a7e73b4fa94d32e0585564217ebe3fc6c',1,'cv::cuda::GpuMat::elemSize()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a6a79fdf2070ede4fd33fd3abb36d7b8b',1,'cv::cudev::GpuMat_::elemSize()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#af4d2f52deeacd51b5ccd07759123e0f0',1,'cv::cuda::HostMem::elemSize()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aba7a5ef00b22b70668fba575005dfe55',1,'cv::Mat::elemSize()'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a17a22f04a8935c8034f0c4b81b68bb44',1,'cv::gapi::own::Mat::elemSize()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9b1cd8c0b180fde075bc856a476232a6',1,'cv::Mat_::elemSize()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9b1cd8c0b180fde075bc856a476232a6',1,'Mat_< double >::elemSize()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9b1cd8c0b180fde075bc856a476232a6',1,'Mat_< float >::elemSize()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9b1cd8c0b180fde075bc856a476232a6',1,'Mat_< uchar >::elemSize()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9b1cd8c0b180fde075bc856a476232a6',1,'Mat_< unsigned char >::elemSize()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af42f343f4f3d5bc974db1eca57417150',1,'cv::SparseMat::elemSize()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a391f71d1da637a234701f78d7b0cc9a5',1,'cv::UMat::elemSize()']]], + ['elemsize1_112',['elemSize1',['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a71e4454b2b0d3e1b4f29c958ab90f28d',1,'cv::ogl::Buffer::elemSize1()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a988831407704239eadc036df1b615de5',1,'cv::cuda::GpuMat::elemSize1()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#aca1348912149f41d5246e3aa2b4c7dce',1,'cv::cudev::GpuMat_::elemSize1()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a350f03863027be4851f1b21ae8514bab',1,'cv::cuda::HostMem::elemSize1()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a9acde8f32d4b294558fb406bc05171bc',1,'cv::Mat::elemSize1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a497f71fadd1274bd6b5c1dfa9421514e',1,'cv::Mat_::elemSize1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a497f71fadd1274bd6b5c1dfa9421514e',1,'Mat_< double >::elemSize1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a497f71fadd1274bd6b5c1dfa9421514e',1,'Mat_< float >::elemSize1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a497f71fadd1274bd6b5c1dfa9421514e',1,'Mat_< uchar >::elemSize1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a497f71fadd1274bd6b5c1dfa9421514e',1,'Mat_< unsigned char >::elemSize1()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a3564e3c77b19ac1104dbe924973dd288',1,'cv::SparseMat::elemSize1()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a318efa69d05f7b4c61488a8ce5125247',1,'cv::UMat::elemSize1()']]], + ['ellint_5f1_113',['ellint_1',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gae6b3df5556f38a7d72f9b4457d856f9c',1,'std::ellint_1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga7d289fce6de2d3ac3abfcecf4f419396',1,'std::tr1::ellint_1()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gae6b3df5556f38a7d72f9b4457d856f9c',1,'ellint_1(_Tp __k, _Tpp __phi)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga7d289fce6de2d3ac3abfcecf4f419396',1,'ellint_1(_Tp __k, _Tpp __phi)(Global Namespace)']]], + ['ellint_5f1f_114',['ellint_1f',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga308d23d70f4b5e848eb7a4173628ef3b',1,'std::ellint_1f()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga308d23d70f4b5e848eb7a4173628ef3b',1,'ellint_1f()(Global Namespace)']]], + ['ellint_5f1l_115',['ellint_1l',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga795383fa51e02351000b410b478d824f',1,'std::ellint_1l()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga795383fa51e02351000b410b478d824f',1,'ellint_1l()(Global Namespace)']]], + ['ellint_5f2_116',['ellint_2',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gad6dd71db2b3f90d24ff49bf8cf37bc37',1,'std::ellint_2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gaca3de93877d9d195863279ef8e2d2b83',1,'std::tr1::ellint_2()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gad6dd71db2b3f90d24ff49bf8cf37bc37',1,'ellint_2(_Tp __k, _Tpp __phi)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gaca3de93877d9d195863279ef8e2d2b83',1,'ellint_2(_Tp __k, _Tpp __phi)(Global Namespace)']]], + ['ellint_5f2f_117',['ellint_2f',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga594a730163c6228c75b152462700062b',1,'std::ellint_2f()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga594a730163c6228c75b152462700062b',1,'ellint_2f()(Global Namespace)']]], + ['ellint_5f2l_118',['ellint_2l',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga5c791332d374a809d8ca16c69a1a30f5',1,'std::ellint_2l()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga5c791332d374a809d8ca16c69a1a30f5',1,'ellint_2l()(Global Namespace)']]], + ['ellint_5f3_119',['ellint_3',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga20832e3a67d25cc3d415cafc88019ac3',1,'std::ellint_3()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga55963b25d9fb39d84193ca03cd6772d4',1,'std::tr1::ellint_3()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga20832e3a67d25cc3d415cafc88019ac3',1,'ellint_3(_Tp __k, _Tpn __nu, _Tpp __phi)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga55963b25d9fb39d84193ca03cd6772d4',1,'ellint_3(_Tp __k, _Tpn __nu, _Tpp __phi)(Global Namespace)']]], + ['ellint_5f3f_120',['ellint_3f',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1a80bd2c15bc9fbecda2630a9e9409e7',1,'std::ellint_3f()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1a80bd2c15bc9fbecda2630a9e9409e7',1,'ellint_3f()(Global Namespace)']]], + ['ellint_5f3l_121',['ellint_3l',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaa8c0e5864df8769021a7f3e21a30c5d2',1,'std::ellint_3l()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaa8c0e5864df8769021a7f3e21a30c5d2',1,'ellint_3l()(Global Namespace)']]], + ['ellipse_122',['ellipse',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga28b2267d35786f5f890ca167236cbc69',1,'cv::ellipse(InputOutputArray img, Point center, Size axes, double angle, double startAngle, double endAngle, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga57be400d8eff22fb946ae90c8e7441f9',1,'cv::ellipse(InputOutputArray img, const RotatedRect &box, const Scalar &color, int thickness=1, int lineType=LINE_8)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga28b2267d35786f5f890ca167236cbc69',1,'ellipse(InputOutputArray img, Point center, Size axes, double angle, double startAngle, double endAngle, const Scalar &color, int thickness=1, int lineType=LINE_8, int shift=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga57be400d8eff22fb946ae90c8e7441f9',1,'ellipse(InputOutputArray img, const RotatedRect &box, const Scalar &color, int thickness=1, int lineType=LINE_8)(Global Namespace)']]], + ['ellipse2poly_123',['ellipse2Poly',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga727a72a3f6a625a2ae035f957c61051f',1,'cv::ellipse2Poly(Point center, Size axes, int angle, int arcStart, int arcEnd, int delta, std::vector< Point > &pts)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga3d9494192ef3a9fd07f02e2377897faf',1,'cv::ellipse2Poly(Point2d center, Size2d axes, int angle, int arcStart, int arcEnd, int delta, std::vector< Point2d > &pts)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga727a72a3f6a625a2ae035f957c61051f',1,'ellipse2Poly(Point center, Size axes, int angle, int arcStart, int arcEnd, int delta, std::vector< Point > &pts)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga3d9494192ef3a9fd07f02e2377897faf',1,'ellipse2Poly(Point2d center, Size2d axes, int angle, int arcStart, int arcEnd, int delta, std::vector< Point2d > &pts)(Global Namespace)']]], + ['ellipses_20for_20contours_124',['Creating Bounding rotated boxes and ellipses for contours',['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'']]], + ['elliptic_5fkeypoint_125',['Elliptic_KeyPoint',['https://docs.opencv.org/4.2.0/d2/d71/classcv_1_1xfeatures2d_1_1Elliptic__KeyPoint.html',1,'cv::xfeatures2d::Elliptic_KeyPoint'],['https://docs.opencv.org/4.2.0/d2/d71/classcv_1_1xfeatures2d_1_1Elliptic__KeyPoint.html#a93cdc46292806df181169af8703e9cd6',1,'cv::xfeatures2d::Elliptic_KeyPoint::Elliptic_KeyPoint()'],['https://docs.opencv.org/4.2.0/d2/d71/classcv_1_1xfeatures2d_1_1Elliptic__KeyPoint.html#a50a7573985031521a52b3dbaf7048b05',1,'cv::xfeatures2d::Elliptic_KeyPoint::Elliptic_KeyPoint(Point2f pt, float angle, Size axes, float size, float si)']]], + ['elname_126',['elname',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae2c1bb9453394d0c8a5f07514eccf94b',1,'cv::FileStorage']]], + ['eltwiselayer_127',['EltwiseLayer',['https://docs.opencv.org/4.2.0/d6/d6a/classcv_1_1dnn_1_1EltwiseLayer.html',1,'cv::dnn']]], + ['elulayer_128',['ELULayer',['https://docs.opencv.org/4.2.0/df/da5/classcv_1_1dnn_1_1ELULayer.html',1,'cv::dnn']]], + ['em_129',['EM',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html',1,'cv::ml']]], + ['emd_130',['EMD',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga902b8e60cc7075c8947345489221e0e0',1,'cv::EMD()'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga902b8e60cc7075c8947345489221e0e0',1,'EMD()(Global Namespace)']]], + ['emdhistogramcostextractor_131',['EMDHistogramCostExtractor',['https://docs.opencv.org/4.2.0/d0/d1c/classcv_1_1EMDHistogramCostExtractor.html',1,'cv']]], + ['emdl1_132',['EMDL1',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gacb101cb63eb94a4a6a61d60e487b18e6',1,'cv::EMDL1()'],['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html#gacb101cb63eb94a4a6a61d60e487b18e6',1,'EMDL1(InputArray signature1, InputArray signature2)(Global Namespace)']]], + ['emdl1_2ehpp_133',['emdL1.hpp',['https://docs.opencv.org/4.2.0/dd/dcb/emdL1_8hpp.html',1,'']]], + ['emdl1histogramcostextractor_134',['EMDL1HistogramCostExtractor',['https://docs.opencv.org/4.2.0/da/d8e/classcv_1_1EMDL1HistogramCostExtractor.html',1,'cv']]], + ['emergencystop_135',['emergencyStop',['../namespacerobot.html#a902b5dd26574990fe0a8a9d3c4e7a97e',1,'robot']]], + ['emergencystopmotors_136',['emergencyStopMotors',['../namespacecan_1_1motor.html#adc2d7e351335d09610a09780cbed9bde',1,'can::motor']]], + ['emission_5fp_137',['emission_p',['https://docs.opencv.org/4.2.0/da/d07/classcv_1_1text_1_1OCRBeamSearchDecoder.html#a9bd0273e8426024953f910cb6bb730be',1,'cv::text::OCRBeamSearchDecoder::emission_p'],['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1text_1_1OCRHMMDecoder.html#a6980a7f7e5a1989b1ab2a5f5fef001a5',1,'cv::text::OCRHMMDecoder::emission_p']]], + ['emplace_138',['emplace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a3ea67e3e7fc5c84e92d9868bb57ae05a',1,'deque< _StateSeqT >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a1b89836dea3d2950a96e485677fe3c30',1,'list< __inp, __rebind_inp >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'match_results< _Bi_iter >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a3ea67e3e7fc5c84e92d9868bb57ae05a',1,'std::deque::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a1b89836dea3d2950a96e485677fe3c30',1,'std::list::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#adbdeb769358f26cc1f0124f5c53df0eb',1,'std::map::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'std::match_results::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a18dc0fd47da3fff883f3c1eab8f71908',1,'std::multimap::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a12431fd574451b7c1e677d09f6d2ef46',1,'std::multiset::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af16da8812db504af3bbf8a682de754d6',1,'std::set::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aa2c22cafc2b6f068358049c8fdb7bda0',1,'std::unordered_map::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a4d00357a4ca15a9cdffa4aef992859c8',1,'std::unordered_multimap::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a31747dab6f248961de2668f292a18565',1,'std::unordered_multiset::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae5af2f1d8d0746c3db3357561a73c6f7',1,'std::unordered_set::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'std::vector::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aa2c22cafc2b6f068358049c8fdb7bda0',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< __diff_type >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _CharClassT >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _CharT >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _Cmpt >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _Node *, _Nodeptr_Alloc >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _RealType >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _State< _TraitsT::char_type > >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< _StringT >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< block_type, allocator_type >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< Catalog_info * >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< double >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< int >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< result_type >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< size_t >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< std::pair< _BiIter, int > >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< std::pair< _StateIdT, std::vector > >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< std::pair< _StrTransT, _StrTransT > >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< sub_match< _Bi_iter >, _Alloc >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::emplace()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ab9f9ca10121c7ca0d2365a92ec7c5a85',1,'vector< sub_match< _BiIter >, _Alloc >::emplace()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac479e609cbd03948bd3e85fb441b66e5.html#ac479e609cbd03948bd3e85fb441b66e5',1,'nlohmann::basic_json::emplace()'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a38834c948b844033caa7d5c76fee5866.html#a38834c948b844033caa7d5c76fee5866',1,'nlohmann::ordered_map::emplace()']]], + ['emplace_5fafter_139',['emplace_after',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a5fd1e68be8454830cea449ad8114cf3d',1,'std::forward_list']]], + ['emplace_5fback_140',['emplace_back',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a15c0a5db4fb12d49433801bbe6436bfb.html#a15c0a5db4fb12d49433801bbe6436bfb',1,'nlohmann::basic_json']]], + ['emplace_5ffront_141',['emplace_front',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#abea57251bbfc9d77cd5ee8ae2bcc52cc',1,'std::forward_list']]], + ['emplace_5fhint_142',['emplace_hint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a01e3c11364a0f9f6304581d1dc69bd34',1,'std::map::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a89892e96cd8b74074e5d83f9d30005c6',1,'std::multimap::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a18406be2849c2b0f4786452e6bd860f5',1,'std::multiset::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ae4eb02463d17b44a49e6d916d05548fe',1,'std::set::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af36454c8cd5831988060bdf85a4d4d6e',1,'std::unordered_map::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af7f415a309a77497c41538b60d358fed',1,'std::unordered_multimap::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a81c1d4a9ff7f0173466deb652ab4f10b',1,'std::unordered_multiset::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a8d66aca929c29059391648628f2e250b',1,'std::unordered_set::emplace_hint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af36454c8cd5831988060bdf85a4d4d6e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::emplace_hint()']]], + ['empty_143',['EMPTY',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a0820aae131d3f3815929ce3c580e9bce',1,'cv::FileNode']]], ['empty_144',['empty',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#aca4fc0e916419225f18026bdc7b1b180',1,'cv::_InputArray::empty()'],['https://docs.opencv.org/4.2.0/d2/d60/structcv_1_1quality_1_1QualityGMSD_1_1__mat__data.html#a27f217209c371d81373e20bffa65101e',1,'cv::quality::QualityGMSD::_mat_data::empty()'],['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#ac9bf35ff66df6d1fc08552bfe9d8f58d',1,'cv::quality::QualitySSIM::_mat_data::empty()'],['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#ab6a18f1825475643e94381697d413972',1,'cv::Algorithm::empty()'],['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a6061bd502601ad12f3c7454c1b68f894',1,'cv::ogl::Arrays::empty()'],['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#a5c900a29bf394dc30fa541fe26f2a294',1,'cv::BaseCascadeClassifier::empty()'],['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html#abb6c25641a9fd6f7428aeeea7d0f1491',1,'cv::face::BasicFaceRecognizer::empty()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a72643c086e437ab3b9f45483ab9efb1d',1,'cv::ogl::Buffer::empty()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a1753ebe58554fe0673ce46cb4e83f08a',1,'cv::CascadeClassifier::empty()'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#ac0951eebe04d00aa66117eab337909e4',1,'cv::DescriptorMatcher::empty()'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a20fffe7c2f0d6ae45c8a4a854c9cba2f',1,'cv::cuda::DescriptorMatcher::empty()'],['https://docs.opencv.org/4.2.0/dd/d65/classcv_1_1face_1_1FaceRecognizer.html#aa60dc36e03135d32b94deaf1bad873f3',1,'cv::face::FaceRecognizer::empty()'],['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html#ae5fbe71c7d46427671a0845934ae063b',1,'cv::Feature2D::empty()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a82d59aab4765da6140c238c54aadfa92',1,'cv::FileNode::empty()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a509710f61e3a7e13b5ebb2b40984900a',1,'cv::cuda::GpuMat::empty()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#afe92b26dbd1a2a1d718504dfb24c1866',1,'cv::cuda::HostMem::empty()'],['https://docs.opencv.org/4.2.0/dc/dc0/classcv_1_1videostab_1_1InpaintingPipeline.html#a1c7c37b854e7aa2852bcd0e4e26ef3bb',1,'cv::videostab::InpaintingPipeline::empty()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a405ff97081b9506249b7f31fd22191d6',1,'cv::ocl::Kernel::empty()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#abbec3525a852e77998aba034813fded4',1,'cv::Mat::empty()'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a045fd480d9260f6824ef90d9f0cbc00e',1,'cv::gapi::own::Mat::empty()'],['https://docs.opencv.org/4.2.0/d9/d76/classcv_1_1videostab_1_1MotionStabilizationPipeline.html#a12b9945fb13a49ef9909ed5d13e7bdd2',1,'cv::videostab::MotionStabilizationPipeline::empty()'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a6a5778787d5b8770deab5eda6968e66c',1,'cv::dnn::Net::empty()'],['https://docs.opencv.org/4.2.0/da/d83/classcv_1_1quality_1_1QualityBase.html#a3223929148393e56a9f01370edde82ee',1,'cv::quality::QualityBase::empty()'],['https://docs.opencv.org/4.2.0/d8/d81/classcv_1_1quality_1_1QualityGMSD.html#adda3eb375a0e081809745aca9e98bacc',1,'cv::quality::QualityGMSD::empty()'],['https://docs.opencv.org/4.2.0/d7/d80/classcv_1_1quality_1_1QualityMSE.html#a9a92754b95a53d71859c2dbf31b68a7a',1,'cv::quality::QualityMSE::empty()'],['https://docs.opencv.org/4.2.0/d8/d0c/classcv_1_1quality_1_1QualityPSNR.html#a658a09005754944d17700c40b2787e52',1,'cv::quality::QualityPSNR::empty()'],['https://docs.opencv.org/4.2.0/d9/db5/classcv_1_1quality_1_1QualitySSIM.html#a85d066936579d6c18aa6a981be331283',1,'cv::quality::QualitySSIM::empty()'],['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#af17854e9243042f39ae1c7a5ef5f7600',1,'cv::Range::empty()'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a6b7f5a0fd792784b865806ef4b6e47f2',1,'cv::Rect_::empty()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a0b48a642590e90eca132348924078521',1,'cv::Size_::empty()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a0b48a642590e90eca132348924078521',1,'Size_< float >::empty()'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#a80afceed1710367d32d6232374162b97',1,'cv::ml::StatModel::empty()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#ac8ce3d2a82f71ddf351c0d96b7e7e679',1,'cv::ogl::Texture2D::empty()'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a32e98c5e7c9596f2be2a80e48de7fc04',1,'cv::tbm::Track::empty()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a8d0149f2671fd776444301cafa0eff8c',1,'cv::UMat::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a716f575836aa6432375acb5485c22b2d',1,'__gnu_cxx::__versa_string::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab7e263d9f94b7e17cc20d37933bd7485',1,'__gnu_debug::basic_string::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11671.html#a860c9763372521ff36822629db34cc95',1,'__gnu_pbds::detail::cc_ht_map::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11711.html#ae49c924b34affd06e7eea76a74acf98a',1,'__gnu_pbds::detail::gp_ht_map::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab7e263d9f94b7e17cc20d37933bd7485',1,'basic_string< _CharT >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab7e263d9f94b7e17cc20d37933bd7485',1,'basic_string< _CharT, _Traits, _Allocator >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab7e263d9f94b7e17cc20d37933bd7485',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab7e263d9f94b7e17cc20d37933bd7485',1,'basic_string< char >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab7e263d9f94b7e17cc20d37933bd7485',1,'basic_string< char, char_traits< char >, _Byte_alloc >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab7e263d9f94b7e17cc20d37933bd7485',1,'basic_string< char_type, _Traits, _Alloc >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab7e263d9f94b7e17cc20d37933bd7485',1,'basic_string< value_type >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a543c658bbc567bee85bcbdc5e6434cd4',1,'deque< _StateSeqT >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad1b7e92459bdaa158f42886f40bcf163',1,'list< __inp, __rebind_inp >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a94d01920ed11a4780dae66d293aab35e',1,'match_results< _Bi_iter >::empty() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a94d01920ed11a4780dae66d293aab35e',1,'match_results< _Bi_iter >::empty() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a07067b807b895db09a39a3a48097ad1e',1,'stack< _StateSeqT >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab7e263d9f94b7e17cc20d37933bd7485',1,'std::basic_string::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a543c658bbc567bee85bcbdc5e6434cd4',1,'std::deque::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#ac07a1a393d499f13f112f6d249fe0da4',1,'std::experimental::fundamentals_v1::any::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ad2d317191a99444c75afc1904f9e49b0',1,'std::forward_list::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad1b7e92459bdaa158f42886f40bcf163',1,'std::list::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a68223384b4922c04b0fea3690c0cd86e',1,'std::map::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a94d01920ed11a4780dae66d293aab35e',1,'std::match_results::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1550b426e3eb105e1175343d3ef096e9',1,'std::multimap::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae82d06bc824399611992e798db596b98',1,'std::multiset::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#a5d5a25af5a3d89470b4c977e0a661e6c',1,'std::priority_queue::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#aa0171e1b4bc129bd9659c28896f14be0',1,'std::queue::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a68faae0a9ca968d89457c0f778678770',1,'std::set::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a07067b807b895db09a39a3a48097ad1e',1,'std::stack::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a5e9ec3b60465558f9e13b5dc8adfdf40',1,'std::tr2::dynamic_bitset::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af0718df37f56976e963e970b35259644',1,'std::unordered_map::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a64692f792811465d45d04a1ce47d0829',1,'std::unordered_multimap::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ad27a0af54e4456a4e304d246de201cb5',1,'std::unordered_multiset::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a089f99c2dafd6fe8cc9baea921265162',1,'std::unordered_set::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'std::vector::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af0718df37f56976e963e970b35259644',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< __diff_type >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< _CharClassT >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< _CharT >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< _Cmpt >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< _Node *, _Nodeptr_Alloc >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< _RealType >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< _State< _TraitsT::char_type > >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< _StringT >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< block_type, allocator_type >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< Catalog_info * >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< double >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< int >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< result_type >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< size_t >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< std::pair< _BiIter, int > >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< std::pair< _StateIdT, std::vector > >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< std::pair< _StrTransT, _StrTransT > >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< sub_match< _Bi_iter >, _Alloc >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::empty()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a0bd14c36c3a9e840e638915ee37d877c',1,'vector< sub_match< _BiIter >, _Alloc >::empty()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5c99855f3e35ff35558cb46139b785f8.html#a5c99855f3e35ff35558cb46139b785f8',1,'nlohmann::basic_json::empty()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a649252bda4a2e75a0915b11a25d8bcc3.html#a649252bda4a2e75a0915b11a25d8bcc3',1,'nlohmann::json_pointer::empty()']]], - ['empty_145',['EMPTY',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a0820aae131d3f3815929ce3c580e9bce',1,'cv::FileNode']]], - ['empty_5farray_5fdesc_146',['empty_array_desc',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga0df8f238141fa6774a4b5098a6546130',1,'cv::empty_array_desc()'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga0df8f238141fa6774a4b5098a6546130',1,'empty_array_desc()(Global Namespace)']]], - ['empty_5fgmat_5fdesc_147',['empty_gmat_desc',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga47609b44d964009a7ec687a67551a6b5',1,'cv::empty_gmat_desc()'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga47609b44d964009a7ec687a67551a6b5',1,'empty_gmat_desc()(Global Namespace)']]], - ['empty_5fscalar_5fdesc_148',['empty_scalar_desc',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#gabcd7881f3d260006187e99c004b58863',1,'cv::empty_scalar_desc()'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#gabcd7881f3d260006187e99c004b58863',1,'empty_scalar_desc()(Global Namespace)']]], - ['emulation_2ehpp_149',['emulation.hpp',['https://docs.opencv.org/4.2.0/dd/d0e/emulation_8hpp.html',1,'']]], - ['enable_20halide_20backend_20for_20improve_20efficiency_150',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], - ['enable_5fif_151',['enable_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04251.html',1,'std']]], - ['enable_5fif_5ft_152',['enable_if_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#gaccc2a55dff256e901d69f67ef213d12c',1,'std::enable_if_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#gaccc2a55dff256e901d69f67ef213d12c',1,'enable_if_t(Global Namespace)']]], - ['enable_5fshared_5ffrom_5fthis_153',['enable_shared_from_this',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06923.html',1,'std']]], - ['enable_5fspecial_5fmembers_2eh_154',['enable_special_members.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00323.html',1,'']]], - ['enablefusion_155',['enableFusion',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#af22e2f1a542d80ea797ba38902c726bd',1,'cv::dnn::Net']]], - ['enableif_156',['EnableIf',['https://docs.opencv.org/4.2.0/dd/d8b/structcv_1_1cudev_1_1EnableIf.html',1,'cv::cudev']]], - ['enc_5ffilebuf_157',['enc_filebuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10383.html',1,'__gnu_cxx']]], - ['enc_5ffilebuf_2eh_158',['enc_filebuf.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01049.html',1,'']]], - ['encode_5fframe_159',['encode_frame',['../classvideo_1_1H264Encoder.html#a53b3a6c6c495bbcbd100e37fabc7bf9a',1,'video::H264Encoder']]], - ['encoded_20image_160',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], - ['encodeparameters_161',['encodeParameters',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a2d2fdf1ab0543fd762b22c6b07a0056e',1,'cv::omnidir::internal']]], - ['encodeparametersstereo_162',['encodeParametersStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#afc0f36819f26738baa9a89f53985581d',1,'cv::omnidir::internal']]], - ['encoder_163',['Encoder',['../classh264encoder_1_1Encoder.html',1,'h264encoder']]], - ['encodercallback_164',['EncoderCallBack',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1cudacodec_1_1EncoderCallBack.html',1,'cv::cudacodec']]], - ['encoderimpl_165',['EncoderImpl',['../classh264encoder_1_1EncoderImpl.html',1,'h264encoder']]], - ['encoderparams_166',['EncoderParams',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html',1,'cv::cudacodec::EncoderParams'],['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#aeb2b4fad493b471a9e9f6d55b3881e35',1,'cv::cudacodec::EncoderParams::EncoderParams()'],['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a16186217b07418ce48250d893c85e385',1,'cv::cudacodec::EncoderParams::EncoderParams(const String &configFile)']]], - ['encoding_20decoding_167',['Video Encoding/Decoding',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html',1,'']]], - ['encoding_5fchar_5ftraits_168',['encoding_char_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10331.html',1,'__gnu_cxx']]], - ['encoding_5fstate_169',['encoding_state',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10327.html',1,'__gnu_cxx']]], - ['encparams_5ft_170',['encparams_t',['../structrobot_1_1encparams__t.html',1,'robot']]], - ['end_171',['end',['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#aba16789fec81858a31c9685d399b62fc',1,'cv::Range::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'basic_ios< char, _Traits >::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'basic_iostream< char >::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'basic_istream< char >::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'basic_istream< char, _Traits >::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'basic_ostream< char >::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'basic_ostream< char, _Traits >::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_fstream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_ifstream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_ios::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_iostream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_istream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_istringstream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_ofstream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_ostream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_ostringstream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_stringstream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::ios_base::end'],['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html#ac8ce662bca842467e0cafb3f7f62b7fd',1,'cv::dnn::Dict::end()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a58b033e34726eb73f0238a1bfbe0c8e9',1,'cv::FileNode::end()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a9dd628eeccedea6e181ca54d41830a62',1,'cv::Mat::end()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a092f54359c99e42729715024fc662182',1,'cv::Mat::end() const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5e02060c1085a73a91d7fe9e8d2583a5',1,'cv::Mat_::end()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a83ac8f6851ed1b1c24091b6f1d619a6a',1,'cv::Mat_::end() const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5e02060c1085a73a91d7fe9e8d2583a5',1,'Mat_< double >::end()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a83ac8f6851ed1b1c24091b6f1d619a6a',1,'Mat_< double >::end() const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5e02060c1085a73a91d7fe9e8d2583a5',1,'Mat_< float >::end()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a83ac8f6851ed1b1c24091b6f1d619a6a',1,'Mat_< float >::end() const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5e02060c1085a73a91d7fe9e8d2583a5',1,'Mat_< uchar >::end()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a83ac8f6851ed1b1c24091b6f1d619a6a',1,'Mat_< uchar >::end() const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5e02060c1085a73a91d7fe9e8d2583a5',1,'Mat_< unsigned char >::end()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a83ac8f6851ed1b1c24091b6f1d619a6a',1,'Mat_< unsigned char >::end() const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a71cef837db3fd9aabef3abb57ae19a1b',1,'cv::SparseMat::end()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a4d3e2d01ec6a363488097ae2b0b3c124',1,'cv::SparseMat::end() const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a4fe2ca854bcafa54cb371146523c7e36',1,'cv::SparseMat::end()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ac004c4119d6e77bfa95e803d9a7dd5fd',1,'cv::SparseMat::end() const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a0d918c7287fdff2d82738667d066fabc',1,'cv::SparseMat_::end()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a7091eccbc3eed537f5ab12944ac61b3e',1,'cv::SparseMat_::end() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a0acafbbfa0d432074373506cc9ed631f',1,'__gnu_cxx::__versa_string::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac99321a98ffc407b9747352bec9551c2',1,'__gnu_cxx::__versa_string::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a0a05d06255dbcf619bb312133b13cc97',1,'__gnu_cxx::temporary_buffer::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09399.html#a8a0b6be67bf27256c7701980673775b6',1,'__gnu_parallel::_PseudoSequence::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12079.html#a91709489f927e5cfb388b57dd05d7f52',1,'__gnu_pbds::sample_trie_access_traits::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11363.html#af95db97b3bb5e9c70c5e4da927727e2d',1,'__gnu_pbds::trie_string_access_traits::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< _CharT >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< _CharT >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< _CharT, _Traits, _Allocator >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< _CharT, _Traits, _Allocator >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< char >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< char >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< char, char_traits< char >, _Byte_alloc >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< char_type, _Traits, _Alloc >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< char_type, _Traits, _Alloc >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< value_type >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< value_type >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a78b2da6c6329349581db042e6bbe2a40',1,'deque< _StateSeqT >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ad1986c3313eec924e6a7531929a82b8d',1,'deque< _StateSeqT >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aba82f0b94c1ed15ccacea0e98aa6cff6',1,'list< __inp, __rebind_inp >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a39a7a20ed70dd4018608a3522d83124d',1,'list< __inp, __rebind_inp >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a90575e6de802e6c4a4999f7f3bb62047',1,'match_results< _Bi_iter >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'match_results< _Bi_iter >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a90575e6de802e6c4a4999f7f3bb62047',1,'match_results< _Bi_iter >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a0a05d06255dbcf619bb312133b13cc97',1,'std::_Temporary_buffer::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'std::basic_string::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'std::basic_string::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a78b2da6c6329349581db042e6bbe2a40',1,'std::deque::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ad1986c3313eec924e6a7531929a82b8d',1,'std::deque::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a7f64feff678dd8cb85d35bd9b08fde54',1,'std::forward_list::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a9a320037c76fc8f0e6f60784dcec1383',1,'std::forward_list::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aba82f0b94c1ed15ccacea0e98aa6cff6',1,'std::list::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a39a7a20ed70dd4018608a3522d83124d',1,'std::list::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a5dfaf89a89106d147fd055c313a291ee',1,'std::map::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a50d3bee624167086813c84cc5fbc0f8f',1,'std::map::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'std::match_results::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a90575e6de802e6c4a4999f7f3bb62047',1,'std::match_results::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ae02e2ac133d3d1753c3b57f5dfd435cc',1,'std::multimap::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a451671d828e1fc84f2a5631518b6d1f8',1,'std::multimap::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aff68f6029ff179bafdadc89212fe1ee0',1,'std::multiset::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a7a35e9e918f87c423c9f1f2362151b26',1,'std::set::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a42872e15c417c6f944d019315553951e',1,'std::unordered_map::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab91675efcde6f50894587cdb2037a4fc',1,'std::unordered_map::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6b763e0c9c40786e19c26f5fa97e3ab6',1,'std::unordered_map::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a606977180c30d7a49a36846a45f4e355',1,'std::unordered_map::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6b763e0c9c40786e19c26f5fa97e3ab6',1,'std::unordered_map::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a606977180c30d7a49a36846a45f4e355',1,'std::unordered_map::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a708a8efab9b1b9d8f1e41ca3ae2caaa5',1,'std::unordered_multimap::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a4209ed9ce2c4549ded624445fa59416f',1,'std::unordered_multimap::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a0921ff9d001238f2f5b92f025378a37d',1,'std::unordered_multimap::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aa7cd9ddc32c88838cfcd1f2cc53ae5ab',1,'std::unordered_multimap::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a0921ff9d001238f2f5b92f025378a37d',1,'std::unordered_multimap::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aa7cd9ddc32c88838cfcd1f2cc53ae5ab',1,'std::unordered_multimap::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a8158b25dee0140da6e109a2592cec0eb',1,'std::unordered_multiset::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aaa3754e88e7218cbd97bad8024a9a20a',1,'std::unordered_multiset::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#adecae97e8a67ad9111c148bc6a85bde5',1,'std::unordered_multiset::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a38af28f07b44fa8ef5ee3ee4d5886762',1,'std::unordered_multiset::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a8158b25dee0140da6e109a2592cec0eb',1,'std::unordered_multiset::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aaa3754e88e7218cbd97bad8024a9a20a',1,'std::unordered_multiset::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#adecae97e8a67ad9111c148bc6a85bde5',1,'std::unordered_multiset::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a38af28f07b44fa8ef5ee3ee4d5886762',1,'std::unordered_multiset::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#aa28c45008761a27eecdaeefaab68fa0e',1,'std::unordered_set::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a9ead8905955f0942591a17d70f8405c8',1,'std::unordered_set::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a70a807c039d620efcfd2b96048c3471a',1,'std::unordered_set::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a124d7201aeadabc2a92e74fde00ec347',1,'std::unordered_set::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#aa28c45008761a27eecdaeefaab68fa0e',1,'std::unordered_set::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a9ead8905955f0942591a17d70f8405c8',1,'std::unordered_set::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a70a807c039d620efcfd2b96048c3471a',1,'std::unordered_set::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a124d7201aeadabc2a92e74fde00ec347',1,'std::unordered_set::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'std::vector::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'std::vector::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a42872e15c417c6f944d019315553951e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab91675efcde6f50894587cdb2037a4fc',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6b763e0c9c40786e19c26f5fa97e3ab6',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a606977180c30d7a49a36846a45f4e355',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6b763e0c9c40786e19c26f5fa97e3ab6',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a606977180c30d7a49a36846a45f4e355',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< __diff_type >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< __diff_type >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _CharClassT >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _CharClassT >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _CharT >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _CharT >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _Cmpt >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _Cmpt >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _Node *, _Nodeptr_Alloc >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _Node *, _Nodeptr_Alloc >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _RealType >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _RealType >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _State< _TraitsT::char_type > >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _State< _TraitsT::char_type > >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _StringT >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _StringT >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< block_type, allocator_type >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< block_type, allocator_type >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< Catalog_info * >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< Catalog_info * >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< double >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< double >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< int >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< int >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< result_type >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< result_type >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< size_t >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< size_t >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< std::pair< _BiIter, int > >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< std::pair< _BiIter, int > >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< std::pair< _StateIdT, std::vector > >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< std::pair< _StateIdT, std::vector > >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< std::pair< _StrTransT, _StrTransT > >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< std::pair< _StrTransT, _StrTransT > >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< sub_match< _Bi_iter >, _Alloc >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< sub_match< _Bi_iter >, _Alloc >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< sub_match< _BiIter >, _Alloc >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< sub_match< _BiIter >, _Alloc >::end() const noexcept'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a69e683fcd5e46fc396ab4204061d66a8',1,'Eigen::DenseBase::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a69e683fcd5e46fc396ab4204061d66a8',1,'DenseBase< ArrayWrapper< ExpressionType > >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a69e683fcd5e46fc396ab4204061d66a8',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a69e683fcd5e46fc396ab4204061d66a8',1,'DenseBase< Solve< Decomposition, RhsType > >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'Eigen::VectorwiseOp::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'Eigen::VectorwiseOp::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const Derived, Horizontal >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const Derived, Horizontal >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const Derived, Vertical >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const Derived, Vertical >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::end() const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a931267ec3f09eb67e4382f321b2c52bc.html#a931267ec3f09eb67e4382f321b2c52bc',1,'nlohmann::basic_json::end() noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a82b5b96f86879a3bac0c713d33178551.html#a82b5b96f86879a3bac0c713d33178551',1,'nlohmann::basic_json::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a11ed6eea7e5fa38dfb88d84bce3c16b9',1,'std::end(_Container &__cont) -> decltype(__cont.end())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad4f45049099b6f3387d8f542201d28d5',1,'std::end(const _Container &__cont) -> decltype(__cont.end())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab0db204cc11475513f0c7013ed51d406',1,'std::end(_Tp(&__arr)[_Nm])'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a579ff3807b61f57bda29d023b3918504',1,'std::end(initializer_list< _Tp > __ils) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga3541bf5385594aac72a9424aa6dd86e1',1,'std::end(valarray< _Tp > &__va)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab777d802b5dfa668d030039c2fd78b3b',1,'std::end(const valarray< _Tp > &__va)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga3541bf5385594aac72a9424aa6dd86e1',1,'end(valarray< _Tp > &__va)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab777d802b5dfa668d030039c2fd78b3b',1,'end(const valarray< _Tp > &__va)(Global Namespace)']]], - ['end_5farray_172',['end_array',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a235ee975617f28e6a996d1e36a282312.html#a235ee975617f28e6a996d1e36a282312',1,'nlohmann::json_sax']]], - ['end_5fobject_173',['end_object',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_ad0c722d53ff97be700ccf6a9468bd456.html#ad0c722d53ff97be700ccf6a9468bd456',1,'nlohmann::json_sax']]], - ['endianlittle_174',['endianLittle',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#aa517940b85a79b02da3f4912465ed406',1,'cv::ocl::Device']]], - ['endl_175',['endl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8b3758bb8f17c440c7963363f42f69f3',1,'std']]], - ['endpointx_176',['endPointX',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a43b634f8f6b5953f2491b00bf6c231f6',1,'cv::line_descriptor::KeyLine']]], - ['endpointy_177',['endPointY',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a1b528bf3d1f3ab902e279ba1b5a593f1',1,'cv::line_descriptor::KeyLine']]], - ['ends_178',['ends',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae870682737bc550409474930f055508b',1,'std']]], - ['endwritechunk_179',['endWriteChunk',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a4a774a8526f6cd0a6ba115c6542c9acb',1,'cv::AVIWriteContainer']]], - ['endwritestruct_180',['endWriteStruct',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ab57944e5c8dacfa7866c70c4ceaaab7b',1,'cv::FileStorage']]], - ['energy_181',['energy',['https://docs.opencv.org/4.2.0/dc/db4/structcv_1_1ml_1_1SimulatedAnnealingSolverSystem.html#a8a83580af0db9f06247bb99862eb64d9',1,'cv::ml::SimulatedAnnealingSolverSystem']]], - ['enforcelabelconnectivity_182',['enforceLabelConnectivity',['https://docs.opencv.org/4.2.0/d5/da0/classcv_1_1ximgproc_1_1SuperpixelLSC.html#a581c406e453505b727dc38739d00d0b2',1,'cv::ximgproc::SuperpixelLSC::enforceLabelConnectivity()'],['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1ximgproc_1_1SuperpixelSLIC.html#ad510b470e0dfde77450ff7c85ed0714c',1,'cv::ximgproc::SuperpixelSLIC::enforceLabelConnectivity()']]], - ['enqueuehostcallback_183',['enqueueHostCallback',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#aaad28e33e26b9c19c8d0c87c1d6f733d',1,'cv::cuda::Stream']]], - ['ensureinclusionconstraint_184',['ensureInclusionConstraint',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga8e28e77e2b7582f3c022e9772117d045',1,'cv::videostab::ensureInclusionConstraint()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga8e28e77e2b7582f3c022e9772117d045',1,'ensureInclusionConstraint()(Global Namespace)']]], - ['ensuresizeisenough_185',['ensureSizeIsEnough',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga4551c222cdf97ebdb4d7440fecfc737a',1,'cv::cuda::ensureSizeIsEnough()'],['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga4551c222cdf97ebdb4d7440fecfc737a',1,'ensureSizeIsEnough()(Global Namespace)']]], - ['ensurewithinwheelspeedlimit_186',['ensureWithinWheelSpeedLimit',['../classkinematics_1_1DiffDriveKinematics.html#adf53055ac0c957c0f4fc7d3954ec3eec',1,'kinematics::DiffDriveKinematics']]], - ['entity_5faabb_5fworld_187',['ENTITY_AABB_WORLD',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8a9b8d138748e3114bc1ebae65837efdfd',1,'cv::ovis::ENTITY_AABB_WORLD'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8a9b8d138748e3114bc1ebae65837efdfd',1,'ENTITY_AABB_WORLD(Global Namespace)']]], - ['entity_5fanimblend_5fmode_188',['ENTITY_ANIMBLEND_MODE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8a4fe0b9f283b57608e744032e28e8d5d8',1,'cv::ovis::ENTITY_ANIMBLEND_MODE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8a4fe0b9f283b57608e744032e28e8d5d8',1,'ENTITY_ANIMBLEND_MODE(Global Namespace)']]], - ['entity_5fmaterial_189',['ENTITY_MATERIAL',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8a255cf920ff3705482c8a2d84630f0d81',1,'cv::ovis::ENTITY_MATERIAL'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8a255cf920ff3705482c8a2d84630f0d81',1,'ENTITY_MATERIAL(Global Namespace)']]], - ['entity_5fscale_190',['ENTITY_SCALE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8ac44a6bd329c63f7560db179852fa9476',1,'cv::ovis::ENTITY_SCALE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8ac44a6bd329c63f7560db179852fa9476',1,'ENTITY_SCALE(Global Namespace)']]], - ['entityproperty_191',['EntityProperty',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga2bc1852949fc37d8ae7acf53ba3b19a8',1,'cv::ovis::EntityProperty'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga2bc1852949fc37d8ae7acf53ba3b19a8',1,'EntityProperty(Global Namespace)']]], - ['entry_5fcmp_192',['entry_cmp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11575.html',1,'__gnu_pbds::detail']]], - ['entry_5fcmp_2ehpp_193',['entry_cmp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01175.html',1,'']]], - ['entry_5fcmp_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20false_20_3e_194',['entry_cmp< _VTp, Cmp_Fn, _Alloc, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11583.html',1,'__gnu_pbds::detail']]], - ['entry_5fcmp_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20true_20_3e_195',['entry_cmp< _VTp, Cmp_Fn, _Alloc, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11579.html',1,'__gnu_pbds::detail']]], - ['entry_5flist_5ffn_5fimps_2ehpp_196',['entry_list_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01265.html',1,'']]], - ['entry_5fmetadata_5fbase_2ehpp_197',['entry_metadata_base.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01355.html',1,'']]], - ['entry_5fpred_198',['entry_pred',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11591.html',1,'__gnu_pbds::detail']]], - ['entry_5fpred_2ehpp_199',['entry_pred.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01178.html',1,'']]], - ['entry_5fpred_3c_20_5fvtp_2c_20pred_2c_20_5falloc_2c_20false_20_3e_200',['entry_pred< _VTp, Pred, _Alloc, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11599.html',1,'__gnu_pbds::detail']]], - ['entry_5fpred_3c_20_5fvtp_2c_20pred_2c_20_5falloc_2c_20true_20_3e_201',['entry_pred< _VTp, Pred, _Alloc, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11595.html',1,'__gnu_pbds::detail']]], - ['enumerations_202',['Enumerations',['https://eigen.tuxfamily.org/dox/group__enums.html',1,'']]], - ['eof_203',['eof',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'basic_ios< char, _Traits >::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'basic_iostream< char >::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'basic_istream< char >::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'basic_istream< char, _Traits >::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'basic_ostream< char >::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'basic_ostream< char, _Traits >::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_fstream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_ifstream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_ios::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_iostream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_istream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_istringstream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_ofstream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_ostream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_ostringstream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_stringstream::eof()']]], - ['eofbit_204',['eofbit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_ios< char, _Traits >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_iostream< char >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_istream< char >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_istream< char, _Traits >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_ostream< char >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_ostream< char, _Traits >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_fstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ifstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ios::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_iostream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_istream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_istringstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ofstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ostream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ostringstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_stringstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::ios_base::eofbit']]], - ['epipolar_20geometry_205',['Epipolar Geometry',['https://docs.opencv.org/4.2.0/da/de9/tutorial_py_epipolar_geometry.html',1,'']]], - ['epointinoctavex_206',['ePointInOctaveX',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a260a577f6dc5778ef2fc668c5df32eb7',1,'cv::line_descriptor::KeyLine']]], - ['epointinoctavey_207',['ePointInOctaveY',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a1f16ffeca01cfc6bfd9cec4c925c4248',1,'cv::line_descriptor::KeyLine']]], - ['epptr_208',['epptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'__gnu_cxx::enc_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'__gnu_cxx::enc_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'__gnu_cxx::stdio_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'__gnu_cxx::stdio_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'__gnu_cxx::stdio_sync_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'__gnu_cxx::stdio_sync_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_filebuf< char_type, traits_type >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_filebuf< char_type, traits_type >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_streambuf< _Elem, _Tr >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_streambuf< _Elem, _Tr >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_streambuf< char, _Traits >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_streambuf< char, _Traits >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_streambuf< char, char_traits< char > >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_streambuf< char, char_traits< char > >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::basic_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::basic_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::basic_streambuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::basic_streambuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::basic_stringbuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::basic_stringbuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::wbuffer_convert::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::wbuffer_convert::epptr() const']]], - ['eps_209',['eps',['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html#a3b26a5ba0c8fc5f764a754dd8eb2189c',1,'cv::dnn::MVNLayer::eps'],['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#a12a0a87af93c54e5b9dd67aea517d2dd',1,'cv::videostab::RansacParams::eps'],['https://docs.opencv.org/4.2.0/d1/d65/classcv_1_1SimilarRects.html#a033c52ed5aa5b2473c169b9c7056ab05',1,'cv::SimilarRects::eps'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga94978663ce70a161bf9c6fa1a35143b0',1,'cv::softdouble::eps()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga7d52b83bca0ec1b316337800ac2986d1',1,'cv::softfloat::eps()']]], - ['eps_210',['EPS',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57a857609e73e7028e638d2ea649f3b45d5',1,'cv::TermCriteria']]], - ['eps_211',['eps',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga7d52b83bca0ec1b316337800ac2986d1',1,]]], - ['eps_5fsvr_212',['EPS_SVR',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fac6fd17721f6a7b5c10f3ae48b78ed944',1,'cv::ml::SVM']]], - ['epsilon_213',['epsilon',['https://docs.opencv.org/4.2.0/d4/dd2/classcv_1_1dnn_1_1BatchNormLayer.html#a6c1e22d35ea56e83747ab94d5890f54d',1,'cv::dnn::BatchNormLayer::epsilon'],['https://docs.opencv.org/4.2.0/dc/df8/classcv_1_1dnn_1_1NormalizeBBoxLayer.html#ac1c3a38875be28fbcfe190319bd54cfa',1,'cv::dnn::NormalizeBBoxLayer::epsilon'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#ad25836c3b6f8feea30dfdcab528e23d1',1,'cv::TermCriteria::epsilon'],['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html#a7638f789207589df873b1121d365ab87',1,'cv::cudev::numeric_limits< double >::epsilon()'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html#a0b4daf70cf2f744a86d1de141c87f26c',1,'cv::cudev::numeric_limits< float >::epsilon()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#a36c481134680c7d422edde6d75346b96',1,'std::numeric_limits::epsilon()'],['../namespaceutil.html#af941384c3c1746bf015a31daf66829ec',1,'util::epsilon']]], - ['eq_5fby_5fless_214',['eq_by_less',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11695.html',1,'__gnu_pbds::detail']]], - ['eq_5fby_5fless_2ehpp_215',['eq_by_less.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01295.html',1,'']]], - ['equal_216',['equal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#aaf5799b2a894bef2fa6763f7017b88b2',1,'std::istreambuf_iterator::equal()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga444f163947d0a55953d1c317b31aee89',1,'std::equal(_IIter1 __first1, _IIter1 __last1, _IIter2 __first2, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad9f16258cd8b86bb63165c004cf660d5',1,'std::equal(_II1 __first1, _II1 __last1, _II2 __first2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga89c2fd41282045655b0edaa54773d4db',1,'std::equal(_II1 __first1, _II1 __last1, _II2 __first2, _II2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga8e56a22bed21e9134369f4b2a47ba407',1,'std::equal(_IIter1 __first1, _IIter1 __last1, _IIter2 __first2, _IIter2 __last2, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga444f163947d0a55953d1c317b31aee89',1,'equal(_IIter1 __first1, _IIter1 __last1, _IIter2 __first2, _BinaryPredicate __binary_pred)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad9f16258cd8b86bb63165c004cf660d5',1,'equal(_II1 __first1, _II1 __last1, _II2 __first2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga89c2fd41282045655b0edaa54773d4db',1,'equal(_II1 __first1, _II1 __last1, _II2 __first2, _II2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga8e56a22bed21e9134369f4b2a47ba407',1,'equal(_IIter1 __first1, _IIter1 __last1, _IIter2 __first2, _IIter2 __last2, _BinaryPredicate __binary_pred)(Global Namespace)']]], - ['equal_5frange_217',['equal_range',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a5e0d4434a099805754b757634f18cc23',1,'std::map::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ae814e0a8ac259c3119c95716748f7819',1,'std::map::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ad849929336a71e065e43fdf6a294140e',1,'std::map::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a14e9a1f958274d603fe083a7b9f50558',1,'std::map::equal_range(const _Kt &__x) const -> decltype(pair< const_iterator, const_iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a5e0d4434a099805754b757634f18cc23',1,'std::map::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ae814e0a8ac259c3119c95716748f7819',1,'std::map::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ad849929336a71e065e43fdf6a294140e',1,'std::map::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a14e9a1f958274d603fe083a7b9f50558',1,'std::map::equal_range(const _Kt &__x) const -> decltype(pair< const_iterator, const_iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a809cb1bf6cdd0a8c13e55515ec5a8e7c',1,'std::multimap::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ac801d3c3f152e5d98036307e9de7e538',1,'std::multimap::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a6bb7a029cda04dcfcc905c4c80516bd9',1,'std::multimap::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2e558be043081e52a931317369759384',1,'std::multimap::equal_range(const _Kt &__x) const -> decltype(pair< const_iterator, const_iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a809cb1bf6cdd0a8c13e55515ec5a8e7c',1,'std::multimap::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ac801d3c3f152e5d98036307e9de7e538',1,'std::multimap::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a6bb7a029cda04dcfcc905c4c80516bd9',1,'std::multimap::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2e558be043081e52a931317369759384',1,'std::multimap::equal_range(const _Kt &__x) const -> decltype(pair< const_iterator, const_iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#af02e09bba88000ac8487f66c9d5f0bdb',1,'std::multiset::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aabff907f910392ba764de55f420727cf',1,'std::multiset::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#add69a9f99e1c6f68636c6c0c9cf57ef6',1,'std::multiset::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ab6135bf8d9a5d292c335e2ca40cdf083',1,'std::multiset::equal_range(const _Kt &__x) const -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#af02e09bba88000ac8487f66c9d5f0bdb',1,'std::multiset::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aabff907f910392ba764de55f420727cf',1,'std::multiset::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#add69a9f99e1c6f68636c6c0c9cf57ef6',1,'std::multiset::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ab6135bf8d9a5d292c335e2ca40cdf083',1,'std::multiset::equal_range(const _Kt &__x) const -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af9f201350c153d3da65fe02191c0129f',1,'std::set::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ae0872a3e56b0583c37aab5d20514b479',1,'std::set::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aad7aaff6e514ff8b528c0d6138342198',1,'std::set::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aae9750edc8da201383f8894b70bbda0b',1,'std::set::equal_range(const _Kt &__x) const -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af9f201350c153d3da65fe02191c0129f',1,'std::set::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ae0872a3e56b0583c37aab5d20514b479',1,'std::set::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aad7aaff6e514ff8b528c0d6138342198',1,'std::set::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aae9750edc8da201383f8894b70bbda0b',1,'std::set::equal_range(const _Kt &__x) const -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a301e117827c134ed289b5d19e5c8a36e',1,'std::unordered_map::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21e644ce722b02f5304757ea9be5b23e',1,'std::unordered_map::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a301e117827c134ed289b5d19e5c8a36e',1,'std::unordered_map::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21e644ce722b02f5304757ea9be5b23e',1,'std::unordered_map::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a55b2bb934fcc4f41eaa67280c73ff1d5',1,'std::unordered_multimap::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a6c608c4a4f2041d5045df49143124cfa',1,'std::unordered_multimap::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a55b2bb934fcc4f41eaa67280c73ff1d5',1,'std::unordered_multimap::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a6c608c4a4f2041d5045df49143124cfa',1,'std::unordered_multimap::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a14673553f519f4299e97892aaff3becf',1,'std::unordered_multiset::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a5c639624ebbe3e667dafad278f21ce05',1,'std::unordered_multiset::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a14673553f519f4299e97892aaff3becf',1,'std::unordered_multiset::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a5c639624ebbe3e667dafad278f21ce05',1,'std::unordered_multiset::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae91bd4ef581ac83337d7cced559349e2',1,'std::unordered_set::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae5f593da6d71d91fb83d2e6023ad8d87',1,'std::unordered_set::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae91bd4ef581ac83337d7cced559349e2',1,'std::unordered_set::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae5f593da6d71d91fb83d2e6023ad8d87',1,'std::unordered_set::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a301e117827c134ed289b5d19e5c8a36e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21e644ce722b02f5304757ea9be5b23e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a301e117827c134ed289b5d19e5c8a36e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21e644ce722b02f5304757ea9be5b23e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga67b70af6f618f2c566d2f1849735fb6e',1,'std::equal_range(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga2d3802f907c482a269e17ec3714d3df0',1,'std::equal_range(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga67b70af6f618f2c566d2f1849735fb6e',1,'equal_range(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga2d3802f907c482a269e17ec3714d3df0',1,'equal_range(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val, _Compare __comp)(Global Namespace)']]], - ['equal_5fsplit_5ftag_218',['equal_split_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09771.html',1,'__gnu_parallel']]], - ['equal_5fto_219',['equal_to',['https://docs.opencv.org/4.2.0/d2/dfd/structcv_1_1cudev_1_1equal__to.html',1,'cv::cudev::equal_to< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07403.html',1,'std::equal_to< _Tp >']]], - ['equal_5fto_3c_20void_20_3e_220',['equal_to< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07443.html',1,'std']]], - ['equalization_221',['Equalization',['https://docs.opencv.org/4.2.0/d4/d1b/tutorial_histogram_equalization.html',1,'Histogram Equalization'],['https://docs.opencv.org/4.2.0/d5/daf/tutorial_py_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization'],['https://docs.opencv.org/4.2.0/d2/d74/tutorial_js_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization']]], - ['equalizehist_222',['equalizeHist',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga7e54091f0c937d49bf84152a16f76d6e',1,'cv::equalizeHist()'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga2384be74bd2feba7e6c46815513f0060',1,'cv::cuda::equalizeHist()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaa7c977c041670443eda46750f3bfaf02',1,'cv::gapi::equalizeHist()'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga7e54091f0c937d49bf84152a16f76d6e',1,'equalizeHist(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaa7c977c041670443eda46750f3bfaf02',1,'equalizeHist(const GMat &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga2384be74bd2feba7e6c46815513f0060',1,'equalizeHist(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['equally_5fsplit_2eh_223',['equally_split.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00890.html',1,'']]], - ['equals_224',['equals',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#a44c6fd7ac40c7338196f1aa8db50e0b4',1,'std::tr2::bool_set']]], - ['equalto_225',['equalTo',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a693c0472549f95a40cb7ea13a602db53',1,'cv::FileNodeIterator']]], - ['erase_226',['erase',['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html#a4017726cf4cb43a34037ef40c2e60204',1,'cv::dnn::Dict::erase()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ad4ff041a2a3771613847b94c761ab1f4',1,'cv::SparseMat::erase(int i0, int i1, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ab00d2c0c7bff3c631d1ac43fe1be45cd',1,'cv::SparseMat::erase(int i0, int i1, int i2, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a6f64485a3f47ba79847a3fdf349b9943',1,'cv::SparseMat::erase(const int *idx, size_t *hashval=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ad63b0c68fd53a88dd84b88151da790e3',1,'__gnu_cxx::__versa_string::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a76c619cf8a8209bc94c50da98772326f',1,'__gnu_cxx::__versa_string::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a936fb32c88d2acb1e3d318cbb53c91a2',1,'__gnu_cxx::__versa_string::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'__gnu_debug::basic_string::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'__gnu_debug::basic_string::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< _CharT >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< _CharT >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< _CharT >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< _CharT, _Traits, _Allocator >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< _CharT, _Traits, _Allocator >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< _CharT, _Traits, _Allocator >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< char >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< char >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< char >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< char, char_traits< char >, _Byte_alloc >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< char, char_traits< char >, _Byte_alloc >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< char, char_traits< char >, _Byte_alloc >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< char_type, _Traits, _Alloc >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< char_type, _Traits, _Alloc >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< char_type, _Traits, _Alloc >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< value_type >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< value_type >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< value_type >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0e0812f0cacd5dfd1108455df4fda375',1,'deque< _StateSeqT >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#af8f15e04574604071004bcdcd3be22fc',1,'deque< _StateSeqT >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aee5d29fe9b6e9494a71022ca980502be',1,'list< __inp, __rebind_inp >::erase(const_iterator __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a927ad4d7e4673d4b2b33a16de379671b',1,'list< __inp, __rebind_inp >::erase(const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'match_results< _Bi_iter >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'match_results< _Bi_iter >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'std::basic_string::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'std::basic_string::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'std::basic_string::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0e0812f0cacd5dfd1108455df4fda375',1,'std::deque::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#af8f15e04574604071004bcdcd3be22fc',1,'std::deque::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aee5d29fe9b6e9494a71022ca980502be',1,'std::list::erase(const_iterator __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a927ad4d7e4673d4b2b33a16de379671b',1,'std::list::erase(const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a6b510fc380b070d899d73a278cbb8faf',1,'std::map::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#aa98a4bd34df51b51262b26f06a657efe',1,'std::map::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ac9ea51e48199ff9a87ea1b855789e53d',1,'std::map::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ae60f51e27db51a169ee4e368d238f69e',1,'std::map::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ac9ea51e48199ff9a87ea1b855789e53d',1,'std::map::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ae60f51e27db51a169ee4e368d238f69e',1,'std::map::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'std::match_results::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'std::match_results::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a158f583b90ec4083b4f50a5e46acfee2',1,'std::multimap::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a5f6fbe45cea6915a1276877d56acc0fd',1,'std::multimap::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a4543f2d47f11611811b27b58c73d2c24',1,'std::multimap::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a9cd3e5f506653300983a32fe9df9fcd5',1,'std::multimap::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a4543f2d47f11611811b27b58c73d2c24',1,'std::multimap::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a9cd3e5f506653300983a32fe9df9fcd5',1,'std::multimap::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aa51df64436f0118f064c49d49c8138f4',1,'std::multiset::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ab9fe5fb5a5638e620268e30e640b104c',1,'std::multiset::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a2fcf6dd3ed37a1bac19ba5e55239d77e',1,'std::multiset::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2122b626db1a6a97c0bec69f4e766591',1,'std::set::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af75595c05a003b09225a0367cbe4d468',1,'std::set::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aa73f253934bbb48e214bb21b89812cbb',1,'std::set::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a56149c061cd4aca92d631f7ad5a5a737',1,'std::unordered_map::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a1b17775816c782568baefd357cd50e88',1,'std::unordered_map::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adef61b0f6b1e43cfdb648e247277ba00',1,'std::unordered_map::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab04b983f5337e79f121f2df4bbaa283c',1,'std::unordered_map::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adef61b0f6b1e43cfdb648e247277ba00',1,'std::unordered_map::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab04b983f5337e79f121f2df4bbaa283c',1,'std::unordered_map::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a09397dfd53f29fdbc8809d37ab11b142',1,'std::unordered_multimap::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aa38e97c00a7b10fb37726206ebc57800',1,'std::unordered_multimap::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a671564fa7d5dd0e04b651e78861c89ba',1,'std::unordered_multimap::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a08eec5ee5f497c48d356443110934fdd',1,'std::unordered_multimap::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a671564fa7d5dd0e04b651e78861c89ba',1,'std::unordered_multimap::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a08eec5ee5f497c48d356443110934fdd',1,'std::unordered_multimap::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af75d57a40e15b929ee8931d5894164fc',1,'std::unordered_multiset::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a8d9f85005b81ca530aeeb413a38824ab',1,'std::unordered_multiset::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a7f56a12c1ac7a74ad413f075b58ddf09',1,'std::unordered_multiset::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ab3d07df2db9b602425527841d3e0e876',1,'std::unordered_multiset::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a7f56a12c1ac7a74ad413f075b58ddf09',1,'std::unordered_multiset::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ab3d07df2db9b602425527841d3e0e876',1,'std::unordered_multiset::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ac935f6a3b65fe0e5629ada1699c86868',1,'std::unordered_set::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#acd7b3eed2fde01c393da9d14f1aa03b9',1,'std::unordered_set::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#acef2fe55c494314acad1104ba1488cf6',1,'std::unordered_set::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a5475af91b7b075f1315091b522eacd3e',1,'std::unordered_set::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#acef2fe55c494314acad1104ba1488cf6',1,'std::unordered_set::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a5475af91b7b075f1315091b522eacd3e',1,'std::unordered_set::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'std::vector::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'std::vector::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a56149c061cd4aca92d631f7ad5a5a737',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a1b17775816c782568baefd357cd50e88',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adef61b0f6b1e43cfdb648e247277ba00',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab04b983f5337e79f121f2df4bbaa283c',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adef61b0f6b1e43cfdb648e247277ba00',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab04b983f5337e79f121f2df4bbaa283c',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< __diff_type >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< __diff_type >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _CharClassT >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _CharClassT >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _CharT >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _CharT >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _Cmpt >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _Cmpt >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _Node *, _Nodeptr_Alloc >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _Node *, _Nodeptr_Alloc >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _RealType >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _RealType >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _State< _TraitsT::char_type > >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _State< _TraitsT::char_type > >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _StringT >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _StringT >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< block_type, allocator_type >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< block_type, allocator_type >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< Catalog_info * >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< Catalog_info * >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< double >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< double >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< int >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< int >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< result_type >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< result_type >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< size_t >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< size_t >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< std::pair< _BiIter, int > >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< std::pair< _BiIter, int > >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< std::pair< _StateIdT, std::vector > >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< std::pair< _StateIdT, std::vector > >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< std::pair< _StrTransT, _StrTransT > >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< std::pair< _StrTransT, _StrTransT > >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< sub_match< _Bi_iter >, _Alloc >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< sub_match< _Bi_iter >, _Alloc >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< sub_match< _BiIter >, _Alloc >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< sub_match< _BiIter >, _Alloc >::erase(const_iterator __first, const_iterator __last)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a494632b69bbe1d0153d3bedad0901b8e.html#a494632b69bbe1d0153d3bedad0901b8e',1,'nlohmann::basic_json::erase(IteratorType pos)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a8ac83750e267e37d5d47591eb44cce42.html#a8ac83750e267e37d5d47591eb44cce42',1,'nlohmann::basic_json::erase(IteratorType first, IteratorType last)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_af72b1c9d1502b02a49a0cb9db9f980ea.html#af72b1c9d1502b02a49a0cb9db9f980ea',1,'nlohmann::basic_json::erase(const typename object_t::key_type &key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a221b943d3228488c14225e55f726cc26.html#a221b943d3228488c14225e55f726cc26',1,'nlohmann::basic_json::erase(const size_type idx)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a583c8976bbf0c137ff8e2439878f3058.html#a583c8976bbf0c137ff8e2439878f3058',1,'nlohmann::ordered_map::erase(const Key &key)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a26053569acb0a858d87482b2fa3d5dc5.html#a26053569acb0a858d87482b2fa3d5dc5',1,'nlohmann::ordered_map::erase(iterator pos)']]], - ['erase_5fafter_227',['erase_after',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a369164fbcb598a49bbd7297eb6f2c5b0',1,'std::forward_list::erase_after(const_iterator __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aa779e251eac11a2d84fa9a2b65921bae',1,'std::forward_list::erase_after(const_iterator __pos, const_iterator __last)']]], - ['erase_5fcan_5fthrow_228',['erase_can_throw',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html#ace925c8be06b3640abb7b6f486290daba04adc70b657d67c81caf60c8722c9ada',1,'__gnu_pbds::container_traits']]], - ['erase_5fif_2eh_229',['erase_if.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00326.html',1,'']]], - ['erf_230',['erf',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ac336e0eba2b12dca8b01da1a006566c3',1,'Eigen']]], - ['erfc_231',['erfc',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a17bcfbd19ed883ecf581f06ac1eeeb8c',1,'Eigen']]], - ['erfilter_232',['ERFilter',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html',1,'cv::text']]], - ['erfilter_2ehpp_233',['erfilter.hpp',['https://docs.opencv.org/4.2.0/df/d05/erfilter_8hpp.html',1,'']]], - ['erfilter_5fnm_5fihsgrad_234',['ERFILTER_NM_IHSGrad',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggadf9a9875b63a06536a6071af56e54971a00b4e765bdc40567ad70beb7df464e06',1,'cv::text::ERFILTER_NM_IHSGrad'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggadf9a9875b63a06536a6071af56e54971a00b4e765bdc40567ad70beb7df464e06',1,'ERFILTER_NM_IHSGrad(Global Namespace)']]], - ['erfilter_5fnm_5frgblgrad_235',['ERFILTER_NM_RGBLGrad',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggadf9a9875b63a06536a6071af56e54971a79e06bd9ad5b17411581ac430f805e66',1,'cv::text::ERFILTER_NM_RGBLGrad'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggadf9a9875b63a06536a6071af56e54971a79e06bd9ad5b17411581ac430f805e66',1,'ERFILTER_NM_RGBLGrad(Global Namespace)']]], - ['ergrouping_236',['erGrouping',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga6299380bbb9141488220bdee62b62cd1',1,'cv::text::erGrouping(InputArray img, InputArrayOfArrays channels, std::vector< std::vector< ERStat > > &regions, std::vector< std::vector< Vec2i > > &groups, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const std::string &filename=std::string(), float minProbablity=0.5)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga807dea4f63f6e2b59c9ac22d35e23926',1,'cv::text::erGrouping(InputArray image, InputArray channel, std::vector< std::vector< Point > > regions, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const String &filename=String(), float minProbablity=(float) 0.5)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga6299380bbb9141488220bdee62b62cd1',1,'erGrouping(InputArray img, InputArrayOfArrays channels, std::vector< std::vector< ERStat > > &regions, std::vector< std::vector< Vec2i > > &groups, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const std::string &filename=std::string(), float minProbablity=0.5)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga807dea4f63f6e2b59c9ac22d35e23926',1,'erGrouping(InputArray image, InputArray channel, std::vector< std::vector< Point > > regions, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const String &filename=String(), float minProbablity=(float) 0.5)(Global Namespace)']]], - ['ergrouping_5fmodes_237',['erGrouping_Modes',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gac71e4c8addcf8f6dabc9b6da401d5eb9',1,'cv::text::erGrouping_Modes'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gac71e4c8addcf8f6dabc9b6da401d5eb9',1,'erGrouping_Modes(Global Namespace)']]], - ['ergrouping_5forientation_5fany_238',['ERGROUPING_ORIENTATION_ANY',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggac71e4c8addcf8f6dabc9b6da401d5eb9aa88b048d788f8f61bcec6c478078e3c4',1,'cv::text::ERGROUPING_ORIENTATION_ANY'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggac71e4c8addcf8f6dabc9b6da401d5eb9aa88b048d788f8f61bcec6c478078e3c4',1,'ERGROUPING_ORIENTATION_ANY(Global Namespace)']]], - ['ergrouping_5forientation_5fhoriz_239',['ERGROUPING_ORIENTATION_HORIZ',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggac71e4c8addcf8f6dabc9b6da401d5eb9a27297f8181275dff67535f204e4bdd62',1,'cv::text::ERGROUPING_ORIENTATION_HORIZ'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggac71e4c8addcf8f6dabc9b6da401d5eb9a27297f8181275dff67535f204e4bdd62',1,'ERGROUPING_ORIENTATION_HORIZ(Global Namespace)']]], - ['erode_240',['erode',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaeb1e0c1033e3f6b891a25d0511362aeb',1,'cv::erode()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga8d275850ccc5009372dd21237dcf1836',1,'cv::gapi::erode()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga1903619622035efbe28ad08151f60ec3',1,'cv::ximgproc::rl::erode()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaeb1e0c1033e3f6b891a25d0511362aeb',1,'erode(InputArray src, OutputArray dst, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga8d275850ccc5009372dd21237dcf1836',1,'erode(const GMat &src, const Mat &kernel, const Point &anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga1903619622035efbe28ad08151f60ec3',1,'erode(InputArray rlSrc, OutputArray rlDest, InputArray rlKernel, bool bBoundaryOn=true, Point anchor=Point(0, 0))(Global Namespace)']]], - ['erode3x3_241',['erode3x3',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga48591777d1073198ece7b0f1c2bd885c',1,'cv::gapi::erode3x3()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga48591777d1073198ece7b0f1c2bd885c',1,'erode3x3(const GMat &src, int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)']]], - ['eroding_20and_20dilating_242',['Eroding and Dilating',['https://docs.opencv.org/4.2.0/db/df6/tutorial_erosion_dilatation.html',1,'']]], - ['erosion_5fdilatation_2emarkdown_243',['erosion_dilatation.markdown',['https://docs.opencv.org/4.2.0/d6/d6c/erosion__dilatation_8markdown.html',1,'']]], - ['err_244',['err',['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a9d60908aaaad08b135bc3d8cea4dd676',1,'cv::Exception::err'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a37cf77db73ddf2eaace21028c99b0cf7',1,'cv::LineIterator::err']]], - ['err_5fcamera_5fparams_5fadjust_5ffail_245',['ERR_CAMERA_PARAMS_ADJUST_FAIL',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a507409ce9435dd89857469d12ec06b45aabbdc1cc372c5aacc5266c5e2df0d492',1,'cv::Stitcher']]], - ['err_5fhomography_5fest_5ffail_246',['ERR_HOMOGRAPHY_EST_FAIL',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a507409ce9435dd89857469d12ec06b45af0b270c03b2a88cd0415c8e3f5e58c3e',1,'cv::Stitcher']]], - ['err_5fneed_5fmore_5fimgs_247',['ERR_NEED_MORE_IMGS',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a507409ce9435dd89857469d12ec06b45a2d8d41bde739520bdc0a75af8c869bbe',1,'cv::Stitcher']]], - ['error_248',['error',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a117c241af3fb1141ad0916a3cf3157ec',1,'Eigen::IterativeSolverBase::error()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga4910d7f86336cd4eff9dd05575667e41',1,'cv::error(const Exception &exc)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gacbd081fdb20423a63cf731569ba70b2b',1,'cv::error(int _code, const String &_err, const char *_func, const char *_file, int _line)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga4910d7f86336cd4eff9dd05575667e41',1,'error(const Exception &exc)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gacbd081fdb20423a63cf731569ba70b2b',1,'error(int _code, const String &_err, const char *_func, const char *_file, int _line)(Global Namespace)']]], - ['error_5fbackref_249',['error_backref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#acc0f88e638558f5c3bb64ea44832493b',1,'std::regex_constants']]], - ['error_5fbadbrace_250',['error_badbrace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a272600147c8274c0d78fcda6b53eb0c6',1,'std::regex_constants']]], - ['error_5fbadrepeat_251',['error_badrepeat',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a47399faadc6f427a172a84d78945394c',1,'std::regex_constants']]], - ['error_5fbrace_252',['error_brace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a23b6569c17f71c8b1c00b515b8e02a0d',1,'std::regex_constants']]], - ['error_5fbrack_253',['error_brack',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ac9ef78846632df7d0916b933191e3bcc',1,'std::regex_constants']]], - ['error_5fcategory_254',['error_category',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02839.html',1,'std::_V2']]], - ['error_5fcode_255',['error_code',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02847.html',1,'std']]], - ['error_5fcollate_256',['error_collate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ade164916507884ce776bba031f7bce60',1,'std::regex_constants']]], - ['error_5fcomplexity_257',['error_complexity',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#acdf6decf6d03ea2275dcec3961719d9a',1,'std::regex_constants']]], - ['error_5fcondition_258',['error_condition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02851.html',1,'std']]], - ['error_5fconstants_2eh_259',['error_constants.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00689.html',1,'']]], - ['error_5fctype_260',['error_ctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a19db2783be8034b2dd52e99657184670',1,'std::regex_constants']]], - ['error_5fescape_261',['error_escape',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a27917cafce40928457c789313f8e7ba6',1,'std::regex_constants']]], - ['error_5fhandler_5ft_262',['error_handler_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a1e7ca76cc3f62626b380be5e18a002d5.html#a1e7ca76cc3f62626b380be5e18a002d5',1,'nlohmann::basic_json']]], - ['error_5fparen_263',['error_paren',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a828988901e2b5aafb2ad06adde9e581b',1,'std::regex_constants']]], - ['error_5frange_264',['error_range',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a38aa5041411e6e3d98057811eb691cd0',1,'std::regex_constants']]], - ['error_5fspace_265',['error_space',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a1200d5e70723aa0ae0153c74fd3d02e0',1,'std::regex_constants']]], - ['error_5fstack_266',['error_stack',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ac625782ad8167c9f36b1e32b65df2159',1,'std::regex_constants']]], - ['error_5ftype_267',['error_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#afe4178e24e6fad9f043d52b9de32e488',1,'std::regex_constants']]], - ['errorcallback_268',['ErrorCallback',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae52d6d11c71181d60f0a30eed078d66d',1,'cv::ErrorCallback'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae52d6d11c71181d60f0a30eed078d66d',1,'ErrorCallback(Global Namespace)']]], - ['errorcorrectionrate_269',['errorCorrectionRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#aae04d6771833012d13220ba2e85a0b60',1,'cv::aruco::DetectorParameters']]], - ['errorcorrectionsupport_270',['errorCorrectionSupport',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ac1b160e5f02fb4903436e1c4bc3fbb9d',1,'cv::ocl::Device']]], - ['errorcovinit_271',['errorCovInit',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a2b362189084591dae0a9a6f570ed82da',1,'cv::tracking::UnscentedKalmanFilterParams']]], - ['errorcovpost_272',['errorCovPost',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a446d8e9a0105b0aa35cd66119c529803',1,'cv::KalmanFilter']]], - ['errorcovpre_273',['errorCovPre',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#ae1bd3a86f10753d723e7174d570d9ac1',1,'cv::KalmanFilter']]], - ['errortypes_274',['ErrorTypes',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gae5b308134f67997a42e5ca48c2713bcb',1,'cv::ml::ErrorTypes'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gae5b308134f67997a42e5ca48c2713bcb',1,'ErrorTypes(Global Namespace)']]], - ['erstat_275',['ERStat',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html',1,'cv::text::ERStat'],['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a34d3b4942b555621de67378df8201648',1,'cv::text::ERStat::ERStat()']]], - ['essentialfromfundamental_276',['essentialFromFundamental',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gab948a699b18e85ed516d6e8e0b32c9e3',1,'cv::sfm::essentialFromFundamental()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gab948a699b18e85ed516d6e8e0b32c9e3',1,'essentialFromFundamental()(Global Namespace)']]], - ['essentialfromrt_277',['essentialFromRt',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga732858c7d49c6a44a4a91451b3374350',1,'cv::sfm::essentialFromRt()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga732858c7d49c6a44a4a91451b3374350',1,'essentialFromRt()(Global Namespace)']]], - ['essentialvector_278',['essentialVector',['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ac91cf37b0cbea9e504c89e021fd289ba',1,'Eigen::HouseholderSequence']]], - ['estimate_279',['estimate',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#ac762326fd8ef33c1ce0e065ee783bc3c',1,'cv::detail::BundleAdjusterBase::estimate()'],['https://docs.opencv.org/4.2.0/df/d15/classcv_1_1detail_1_1Estimator.html#ab65ae24f4d6b53554dcc04121e6cbc47',1,'cv::detail::Estimator::estimate()'],['https://docs.opencv.org/4.2.0/d9/db3/classcv_1_1videostab_1_1FromFileMotionReader.html#a7a8a8ce829aa88a3ab8e54ed3f5f66d3',1,'cv::videostab::FromFileMotionReader::estimate()'],['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html#ad00c9820ae28ce5a00edcfc5df526ea2',1,'cv::videostab::ImageMotionEstimatorBase::estimate()'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a5fb98833d57373577ba78799b5abe7e6',1,'cv::videostab::KeypointBasedMotionEstimator::estimate(const Mat &frame0, const Mat &frame1, bool *ok=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a3852d2f99345896839dd1efab0898a0e',1,'cv::videostab::KeypointBasedMotionEstimator::estimate(InputArray frame0, InputArray frame1, bool *ok=0)'],['https://docs.opencv.org/4.2.0/db/ddd/classcv_1_1dnn_1_1KeypointsModel.html#a40440d09b67faa468d333374af49e8de',1,'cv::dnn::KeypointsModel::estimate()'],['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html#ad2e3669f3ccb019194cdb770acc6412f',1,'cv::videostab::MotionEstimatorBase::estimate()'],['https://docs.opencv.org/4.2.0/d7/d29/classcv_1_1videostab_1_1MotionEstimatorL1.html#a835b18ec5c6a51d8e82206c50172252b',1,'cv::videostab::MotionEstimatorL1::estimate()'],['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#ab53cec01615fedc6bddef9caeb2e3be7',1,'cv::videostab::MotionEstimatorRansacL2::estimate()'],['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html#afe97e4ca5c85a4ea7ef76e9b6e86a286',1,'cv::videostab::ToFileMotionWriter::estimate()'],['https://docs.opencv.org/4.2.0/d2/db9/classcv_1_1TrackerStateEstimator.html#a14eb1b71daf5ec2dba9a51cdff2c230a',1,'cv::TrackerStateEstimator::estimate()']]], - ['estimateaffine2d_280',['estimateAffine2D',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga27865b1d26bac9ce91efaee83e94d4dd',1,'cv::estimateAffine2D()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga27865b1d26bac9ce91efaee83e94d4dd',1,'estimateAffine2D()(Global Namespace)']]], - ['estimateaffine3d_281',['estimateAffine3D',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga396afb6411b30770e56ab69548724715',1,'cv::estimateAffine3D()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga396afb6411b30770e56ab69548724715',1,'estimateAffine3D()(Global Namespace)']]], - ['estimateaffinepartial2d_282',['estimateAffinePartial2D',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad767faff73e9cbd8b9d92b955b50062d',1,'cv::estimateAffinePartial2D()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad767faff73e9cbd8b9d92b955b50062d',1,'estimateAffinePartial2D(InputArray from, InputArray to, OutputArray inliers=noArray(), int method=RANSAC, double ransacReprojThreshold=3, size_t maxIters=2000, double confidence=0.99, size_t refineIters=10)(Global Namespace)']]], - ['estimated_5fcovariance_2ehpp_283',['estimated_covariance.hpp',['https://docs.opencv.org/4.2.0/d1/dff/estimated__covariance_8hpp.html',1,'']]], - ['estimatedgaussdistribution_284',['EstimatedGaussDistribution',['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1EstimatedGaussDistribution.html',1,'cv::EstimatedGaussDistribution'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1EstimatedGaussDistribution.html#a08ad979ec6e7e923c121ef3257ebc1f6',1,'cv::EstimatedGaussDistribution::EstimatedGaussDistribution()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1EstimatedGaussDistribution.html#a402815fa7f320edac9cf07b5eb66273e',1,'cv::EstimatedGaussDistribution::EstimatedGaussDistribution(float P_mean, float R_mean, float P_sigma, float R_sigma)']]], - ['estimatefocal_285',['estimateFocal',['https://docs.opencv.org/4.2.0/d4/dbc/group__stitching__autocalib.html#ga7de597a5c64fc2b9e64e7889936fd370',1,'cv::detail::estimateFocal()'],['https://docs.opencv.org/4.2.0/d4/dbc/group__stitching__autocalib.html#ga7de597a5c64fc2b9e64e7889936fd370',1,'estimateFocal()(Global Namespace)']]], - ['estimateglobalmotionleastsquares_286',['estimateGlobalMotionLeastSquares',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga8fa2f6a88df65ad78241783faffc26a8',1,'cv::videostab::estimateGlobalMotionLeastSquares()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga8fa2f6a88df65ad78241783faffc26a8',1,'estimateGlobalMotionLeastSquares()(Global Namespace)']]], - ['estimateglobalmotionransac_287',['estimateGlobalMotionRansac',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga6260bd61792a7ec94ea974af9d94ead7',1,'cv::videostab::estimateGlobalMotionRansac()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga6260bd61792a7ec94ea974af9d94ead7',1,'estimateGlobalMotionRansac()(Global Namespace)']]], - ['estimateimpl_288',['estimateImpl',['https://docs.opencv.org/4.2.0/d2/db9/classcv_1_1TrackerStateEstimator.html#a314006b0b08b9c55e44428ad19914e01',1,'cv::TrackerStateEstimator::estimateImpl()'],['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a4acd63175a1a90d81cd337fcecdcbd91',1,'cv::TrackerStateEstimatorAdaBoosting::estimateImpl()'],['https://docs.opencv.org/4.2.0/d9/d20/classcv_1_1TrackerStateEstimatorMILBoosting.html#a5b38ddc64b2ef01c59ac7f66343a6087',1,'cv::TrackerStateEstimatorMILBoosting::estimateImpl()'],['https://docs.opencv.org/4.2.0/d3/db6/classcv_1_1TrackerStateEstimatorSVM.html#a556e041be7d663ddc7a39e8b3045567d',1,'cv::TrackerStateEstimatorSVM::estimateImpl()']]], - ['estimatemotion_289',['estimateMotion',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#a323e46ff64d821fec51375c4334602bf',1,'cv::videostab::OnePassStabilizer::estimateMotion()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ae07ca7a4967e6158cc157fd61c63cf1f',1,'cv::videostab::StabilizerBase::estimateMotion()'],['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a8687b647f3fec34b52d0f77699b9e2fc',1,'cv::videostab::TwoPassStabilizer::estimateMotion()']]], - ['estimatenewcameramatrixforundistortrectify_290',['estimateNewCameraMatrixForUndistortRectify',['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga384940fdf04c03e362e94b6eb9b673c9',1,'cv::fisheye::estimateNewCameraMatrixForUndistortRectify()'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga384940fdf04c03e362e94b6eb9b673c9',1,'estimateNewCameraMatrixForUndistortRectify()(Global Namespace)']]], - ['estimateoptimaltrimratio_291',['estimateOptimalTrimRatio',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#gab049af45e7db622406b58686e81fa5e2',1,'cv::videostab::estimateOptimalTrimRatio()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#gab049af45e7db622406b58686e81fa5e2',1,'estimateOptimalTrimRatio()(Global Namespace)']]], - ['estimateposeboard_292',['estimatePoseBoard',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga366993d29fdddd995fba8c2e6ca811ea',1,'cv::aruco::estimatePoseBoard()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga366993d29fdddd995fba8c2e6ca811ea',1,'estimatePoseBoard()(Global Namespace)']]], - ['estimateposecharucoboard_293',['estimatePoseCharucoBoard',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga21b51b9e8c6422a4bac27e48fa0a150b',1,'cv::aruco::estimatePoseCharucoBoard()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga21b51b9e8c6422a4bac27e48fa0a150b',1,'estimatePoseCharucoBoard()(Global Namespace)']]], - ['estimateposesinglemarkers_294',['estimatePoseSingleMarkers',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga84dd2e88f3e8c3255eb78e0f79571bd1',1,'cv::aruco::estimatePoseSingleMarkers()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga84dd2e88f3e8c3255eb78e0f79571bd1',1,'estimatePoseSingleMarkers()(Global Namespace)']]], - ['estimaterecommendedparams_295',['estimateRecommendedParams',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#ae832759d923616b73102037c15c43b58',1,'cv::cuda::StereoBeliefPropagation::estimateRecommendedParams()'],['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1cuda_1_1StereoConstantSpaceBP.html#ac72baf7587fc27cb68df1039d173bb9e',1,'cv::cuda::StereoConstantSpaceBP::estimateRecommendedParams()']]], - ['estimaterigidtransform_296',['estimateRigidTransform',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga762cbe5efd52cf078950196f3c616d48',1,'cv::estimateRigidTransform()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga762cbe5efd52cf078950196f3c616d48',1,'estimateRigidTransform()(Global Namespace)']]], - ['estimatestabilizationmotion_297',['estimateStabilizationMotion',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#af3cc7a6d53edae0840100cdce5faa60d',1,'cv::videostab::OnePassStabilizer::estimateStabilizationMotion()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a7cd53ec2cebeeefb57ca5616d3de6ca8',1,'cv::videostab::StabilizerBase::estimateStabilizationMotion()'],['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a264e8021418f46c36788fd999ecfdd7b',1,'cv::videostab::TwoPassStabilizer::estimateStabilizationMotion()']]], - ['estimatetransform_298',['estimateTransform',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a4c25557af4d40a79a4d1f23d9548131d',1,'cv::Stitcher']]], - ['estimatetransformation_299',['estimateTransformation',['https://docs.opencv.org/4.2.0/d5/d72/classcv_1_1ximgproc_1_1ContourFitting.html#af9cd9550a5d1103f687367680f4e0918',1,'cv::ximgproc::ContourFitting::estimateTransformation(InputArray src, InputArray dst, OutputArray alphaPhiST, double *dist=0, bool fdContour=false)'],['https://docs.opencv.org/4.2.0/d5/d72/classcv_1_1ximgproc_1_1ContourFitting.html#accc14ec480558af80be47abf1134daf0',1,'cv::ximgproc::ContourFitting::estimateTransformation(InputArray src, InputArray dst, OutputArray alphaPhiST, double &dist, bool fdContour=false)'],['https://docs.opencv.org/4.2.0/df/dfe/classcv_1_1ShapeTransformer.html#a84a188b7268a28a7b99260307bb38fcc',1,'cv::ShapeTransformer::estimateTransformation()']]], - ['estimateuncertainties_300',['estimateUncertainties',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a9f80a603d0bfeb29a52e0c3ffa01b013',1,'cv::omnidir::internal']]], - ['estimateuncertaintiesstereo_301',['estimateUncertaintiesStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#afc136088b0f942287339de93bc150f9f',1,'cv::omnidir::internal']]], - ['estimation_302',['Estimation',['https://docs.opencv.org/4.2.0/d5/dab/tutorial_sfm_trajectory_estimation.html',1,'Camera Motion Estimation'],['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'CNN for 3D Object Classification and Pose Estimation'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html',1,'Global Motion Estimation'],['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html',1,'Human Pose Estimation'],['https://docs.opencv.org/4.2.0/d7/d53/tutorial_py_pose.html',1,'Pose Estimation'],['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html',1,'Robust Estimation'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html',1,'Rotation Estimation'],['https://docs.opencv.org/4.2.0/d9/d24/group__stitching__seam.html',1,'Seam Estimation']]], - ['estimation_20api_303',['3D object recognition and pose estimation API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'']]], - ['estimation_20of_20a_20textured_20object_304',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], - ['estimator_305',['Estimator',['https://docs.opencv.org/4.2.0/df/d15/classcv_1_1detail_1_1Estimator.html',1,'cv::detail']]], - ['estimator_306',['estimator',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a5a9a51ac0f2fab42c1d694f88e1d6c2d',1,'cv::Stitcher::estimator()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad872c75dcdf2b2006b24b7bc05079ac9',1,'cv::Stitcher::estimator() const']]], - ['euclideantohomogeneous_307',['euclideanToHomogeneous',['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#gaed1efbb8c79c48bfaaa78118bf2c3694',1,'cv::sfm::euclideanToHomogeneous()'],['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#gaed1efbb8c79c48bfaaa78118bf2c3694',1,'euclideanToHomogeneous()(Global Namespace)']]], - ['euler_308',['euler',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#ad9b527f26b444a0a139f4b99d0134812',1,'cv::text::ERStat']]], - ['eulerangles_309',['eulerAngles',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga17994d2e81b723295f5bc3b1f862ed3b',1,'Eigen::MatrixBase::eulerAngles()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga17994d2e81b723295f5bc3b1f862ed3b',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::eulerAngles()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga17994d2e81b723295f5bc3b1f862ed3b',1,'MatrixBase< Solve< Decomposition, RhsType > >::eulerAngles()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga17994d2e81b723295f5bc3b1f862ed3b',1,'eulerAngles()(Global Namespace)']]], - ['eulerangles_5ft_310',['eulerangles_t',['../structnavtypes_1_1eulerangles__t.html',1,'navtypes']]], - ['euleranglestoquat_311',['eulerAnglesToQuat',['../namespaceutil.html#afe82846305c20a7bcdcb348b11b68ad4',1,'util']]], - ['eval_312',['eval',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html#a766941830e3622de365cafb87b20d0b8',1,'cv::BaseClassifier::eval()'],['https://docs.opencv.org/4.2.0/d0/d4f/classcv_1_1text_1_1ERFilter_1_1Callback.html#a6ba6d064e87f1c1a2660df7ebd2f942c',1,'cv::text::ERFilter::Callback::eval()'],['https://docs.opencv.org/4.2.0/db/dc0/classcv_1_1text_1_1OCRHMMDecoder_1_1ClassifierCallback.html#a25fb8e9d78d17da4ec525f00cb8a434c',1,'cv::text::OCRHMMDecoder::ClassifierCallback::eval()'],['https://docs.opencv.org/4.2.0/de/d2d/classcv_1_1text_1_1OCRBeamSearchDecoder_1_1ClassifierCallback.html#a9d7e439c966917e79ff93542339345a5',1,'cv::text::OCRBeamSearchDecoder::ClassifierCallback::eval()'],['https://docs.opencv.org/4.2.0/d7/dd9/classcv_1_1ClassifierThreshold.html#a97e554d46f32c37c9f3f8f2d0de0e72f',1,'cv::ClassifierThreshold::eval()'],['https://docs.opencv.org/4.2.0/d3/d52/classcv_1_1CvHaarEvaluator_1_1FeatureHaar.html#aa6f4ea04e5ad2fbef12fe2a6c13d1848',1,'cv::CvHaarEvaluator::FeatureHaar::eval()'],['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html#a24e31ac70362133d820b5cc917b8c945',1,'cv::StrongClassifierDirectSelection::eval()'],['https://docs.opencv.org/4.2.0/da/d94/classcv_1_1WeakClassifierHaarFeature.html#a34506482d31d1515dd89abd04eba2376',1,'cv::WeakClassifierHaarFeature::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1BaseExpr.html#a4149f50157823063e59c18ce04ed2496',1,'Eigen::symbolic::BaseExpr::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1BaseExpr.html#a4149f50157823063e59c18ce04ed2496',1,'BaseExpr< SymbolExpr< tag > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa73e57a2f0f7cfcb4ad4d55ea0b6414b',1,'Eigen::DenseBase::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa73e57a2f0f7cfcb4ad4d55ea0b6414b',1,'DenseBase< ArrayWrapper< ExpressionType > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa73e57a2f0f7cfcb4ad4d55ea0b6414b',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa73e57a2f0f7cfcb4ad4d55ea0b6414b',1,'DenseBase< Solve< Decomposition, RhsType > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a761bd872a06b59632fcff7b7807a77ce',1,'Eigen::SparseMatrixBase::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a761bd872a06b59632fcff7b7807a77ce',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a761bd872a06b59632fcff7b7807a77ce',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a761bd872a06b59632fcff7b7807a77ce',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a761bd872a06b59632fcff7b7807a77ce',1,'SparseMatrixBase< Transpose< MatrixType > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a761bd872a06b59632fcff7b7807a77ce',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::eval()']]], - ['evalbeforeassigningbit_313',['EvalBeforeAssigningBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gae4b8ae7db0d83f9bbed26b261e60e139',1,'Eigen::EvalBeforeAssigningBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gae4b8ae7db0d83f9bbed26b261e60e139',1,'EvalBeforeAssigningBit(Global Namespace)']]], - ['evalbeforenestingbit_314',['EvalBeforeNestingBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gaa34e83bae46a8eeae4e69ebe3aaecbed',1,'Eigen::EvalBeforeNestingBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gaa34e83bae46a8eeae4e69ebe3aaecbed',1,'EvalBeforeNestingBit(Global Namespace)']]], - ['evalto_315',['evalTo',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a604d4f76a376ced36f8b9c3374c76c3e',1,'Eigen::TriangularBase::evalTo()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a604d4f76a376ced36f8b9c3374c76c3e',1,'TriangularBase< SelfAdjointView< _MatrixType, UpLo > >::evalTo()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a604d4f76a376ced36f8b9c3374c76c3e',1,'TriangularBase< SelfAdjointView< const Derived, UpLo > >::evalTo()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a604d4f76a376ced36f8b9c3374c76c3e',1,'TriangularBase< TriangularView< _MatrixType, _Mode > >::evalTo()']]], - ['evaltolazy_316',['evalToLazy',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#ab8db3e55eee50cdc56650b3498e235eb',1,'Eigen::TriangularBase::evalToLazy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#ab8db3e55eee50cdc56650b3498e235eb',1,'TriangularBase< SelfAdjointView< _MatrixType, UpLo > >::evalToLazy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#ab8db3e55eee50cdc56650b3498e235eb',1,'TriangularBase< SelfAdjointView< const Derived, UpLo > >::evalToLazy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#ab8db3e55eee50cdc56650b3498e235eb',1,'TriangularBase< TriangularView< _MatrixType, _Mode > >::evalToLazy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#ab8db3e55eee50cdc56650b3498e235eb',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::evalToLazy()']]], - ['evaluatefeaturedetector_317',['evaluateFeatureDetector',['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#gac78532caa0ee7744ab370c9a479ec397',1,'cv::evaluateFeatureDetector()'],['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#gac78532caa0ee7744ab370c9a479ec397',1,'evaluateFeatureDetector(const Mat &img1, const Mat &img2, const Mat &H1to2, std::vector< KeyPoint > *keypoints1, std::vector< KeyPoint > *keypoints2, float &repeatability, int &correspCount, const Ptr< FeatureDetector > &fdetector=Ptr< FeatureDetector >())(Global Namespace)']]], - ['evaluation_20and_20aliasing_318',['Lazy Evaluation and Aliasing',['https://eigen.tuxfamily.org/dox/TopicLazyEvaluation.html',1,'']]], - ['evenlevels_319',['evenLevels',['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga2f2cbd21dc6d7367a7c4ee1a826f389d',1,'cv::cuda::evenLevels()'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga2f2cbd21dc6d7367a7c4ee1a826f389d',1,'evenLevels()(Global Namespace)']]], - ['event_320',['Event',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html',1,'cv::cuda::Event'],['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#a88b24ea26be108a2974abe6705d2a56e',1,'cv::cuda::Event::Event()']]], - ['event_321',['event',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'basic_ios< char, _Traits >::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'basic_iostream< char >::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'basic_istream< char >::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'basic_istream< char, _Traits >::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'basic_ostream< char >::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'basic_ostream< char, _Traits >::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_fstream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_ifstream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_ios::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_iostream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_istream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_istringstream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_ofstream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_ostream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_ostringstream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_stringstream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::ios_base::event']]], - ['event_5fcallback_322',['event_callback',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'basic_ios< char, _Traits >::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'basic_iostream< char >::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'basic_istream< char >::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'basic_istream< char, _Traits >::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'basic_ostream< char >::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'basic_ostream< char, _Traits >::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_fstream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_ifstream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_ios::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_iostream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_istream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_istringstream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_ofstream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_ostream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_ostringstream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_stringstream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::ios_base::event_callback']]], - ['event_5fflag_5faltkey_323',['EVENT_FLAG_ALTKEY',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25ceadb29046ba08e95d11696fdfd1ddb61bb',1,'cv::EVENT_FLAG_ALTKEY'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25ceadb29046ba08e95d11696fdfd1ddb61bb',1,'EVENT_FLAG_ALTKEY(Global Namespace)']]], - ['event_5fflag_5fctrlkey_324',['EVENT_FLAG_CTRLKEY',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea5876848aeb4e7cc282d461f94e45a07f',1,'cv::EVENT_FLAG_CTRLKEY'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea5876848aeb4e7cc282d461f94e45a07f',1,'EVENT_FLAG_CTRLKEY(Global Namespace)']]], - ['event_5fflag_5flbutton_325',['EVENT_FLAG_LBUTTON',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cead9b7a4f148eeff7eca24609f7a64adb1',1,'cv::EVENT_FLAG_LBUTTON'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cead9b7a4f148eeff7eca24609f7a64adb1',1,'EVENT_FLAG_LBUTTON(Global Namespace)']]], - ['event_5fflag_5fmbutton_326',['EVENT_FLAG_MBUTTON',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea9879aaef8e0ee2e8b8c9901774bfd594',1,'cv::EVENT_FLAG_MBUTTON'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea9879aaef8e0ee2e8b8c9901774bfd594',1,'EVENT_FLAG_MBUTTON(Global Namespace)']]], - ['event_5fflag_5frbutton_327',['EVENT_FLAG_RBUTTON',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea1bf3e58fcb83ff3e93cdd425299a9ff4',1,'cv::EVENT_FLAG_RBUTTON'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea1bf3e58fcb83ff3e93cdd425299a9ff4',1,'EVENT_FLAG_RBUTTON(Global Namespace)']]], - ['event_5fflag_5fshiftkey_328',['EVENT_FLAG_SHIFTKEY',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea61da926b22fd4fd3aa226ef1d2893102',1,'cv::EVENT_FLAG_SHIFTKEY'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea61da926b22fd4fd3aa226ef1d2893102',1,'EVENT_FLAG_SHIFTKEY(Global Namespace)']]], - ['event_5flbuttondblclk_329',['EVENT_LBUTTONDBLCLK',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0ad3b2124722127f85f6b335aee8ae5fcc',1,'cv::EVENT_LBUTTONDBLCLK'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0ad3b2124722127f85f6b335aee8ae5fcc',1,'EVENT_LBUTTONDBLCLK(Global Namespace)']]], - ['event_5flbuttondown_330',['EVENT_LBUTTONDOWN',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0ad3419100fc2d7688c6dbe3da030fbfd9',1,'cv::EVENT_LBUTTONDOWN'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0ad3419100fc2d7688c6dbe3da030fbfd9',1,'EVENT_LBUTTONDOWN(Global Namespace)']]], - ['event_5flbuttonup_331',['EVENT_LBUTTONUP',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a59cad7ffe959adf2782a110196d47bf6',1,'cv::EVENT_LBUTTONUP'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a59cad7ffe959adf2782a110196d47bf6',1,'EVENT_LBUTTONUP(Global Namespace)']]], - ['event_5fmbuttondblclk_332',['EVENT_MBUTTONDBLCLK',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0afeedd6a768596d14c81bf304760edfe4',1,'cv::EVENT_MBUTTONDBLCLK'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0afeedd6a768596d14c81bf304760edfe4',1,'EVENT_MBUTTONDBLCLK(Global Namespace)']]], - ['event_5fmbuttondown_333',['EVENT_MBUTTONDOWN',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a1dd67e6d96873c36dd3a9670e8312a28',1,'cv::EVENT_MBUTTONDOWN'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a1dd67e6d96873c36dd3a9670e8312a28',1,'EVENT_MBUTTONDOWN(Global Namespace)']]], - ['event_5fmbuttonup_334',['EVENT_MBUTTONUP',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0ab3fce84f2dca833e150779637db7dc1c',1,'cv::EVENT_MBUTTONUP'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0ab3fce84f2dca833e150779637db7dc1c',1,'EVENT_MBUTTONUP(Global Namespace)']]], - ['event_5fmousehwheel_335',['EVENT_MOUSEHWHEEL',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a8c85fc9f3e42b5f4baab925cc5cce753',1,'cv::EVENT_MOUSEHWHEEL'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a8c85fc9f3e42b5f4baab925cc5cce753',1,'EVENT_MOUSEHWHEEL(Global Namespace)']]], - ['event_5fmousemove_336',['EVENT_MOUSEMOVE',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a8f2ec5fd35fe3f4b696518b146dcf675',1,'cv::EVENT_MOUSEMOVE'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a8f2ec5fd35fe3f4b696518b146dcf675',1,'EVENT_MOUSEMOVE(Global Namespace)']]], - ['event_5fmousewheel_337',['EVENT_MOUSEWHEEL',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a402b86eed36ef6cc00cb7425e817af66',1,'cv::EVENT_MOUSEWHEEL'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a402b86eed36ef6cc00cb7425e817af66',1,'EVENT_MOUSEWHEEL(Global Namespace)']]], - ['event_5frbuttondblclk_338',['EVENT_RBUTTONDBLCLK',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a32fba0899e8c3664d5252c059ce83d75',1,'cv::EVENT_RBUTTONDBLCLK'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a32fba0899e8c3664d5252c059ce83d75',1,'EVENT_RBUTTONDBLCLK(Global Namespace)']]], - ['event_5frbuttondown_339',['EVENT_RBUTTONDOWN',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0aa3536f83b6f48da5121041f58fc7a683',1,'cv::EVENT_RBUTTONDOWN'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0aa3536f83b6f48da5121041f58fc7a683',1,'EVENT_RBUTTONDOWN(Global Namespace)']]], - ['event_5frbuttonup_340',['EVENT_RBUTTONUP',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0aacdda7d94278928c34b61a7bd8be9f62',1,'cv::EVENT_RBUTTONUP'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0aacdda7d94278928c34b61a7bd8be9f62',1,'EVENT_RBUTTONUP(Global Namespace)']]], - ['eventaccessor_341',['EventAccessor',['https://docs.opencv.org/4.2.0/da/d71/structcv_1_1cuda_1_1EventAccessor.html',1,'cv::cuda::EventAccessor'],['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa2076bfa2bf524ce953940722f01f158',1,'cv::cuda::Event::EventAccessor']]], - ['eventid_5ft_342',['eventid_t',['../classutil_1_1PeriodicScheduler.html#a80faf4ffb1eed4e2d2ac9984be201d55',1,'util::PeriodicScheduler']]], - ['exact_5ftag_343',['exact_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09735.html',1,'__gnu_parallel']]], - ['example_344',['Example',['../cameraconfig.html#example',1,'']]], - ['example_345',['What happens inside Eigen, on a simple example',['https://eigen.tuxfamily.org/dox/TopicInsideEigenExample.html',1,'']]], - ['exception_346',['Exception',['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html',1,'cv']]], - ['exception_347',['exception',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05487.html',1,'std::exception'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00026.html',1,'(Global Namespace)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a14824c27188d2fee4861806cd5f23d22.html#a14824c27188d2fee4861806cd5f23d22',1,'nlohmann::basic_json::exception']]], - ['exception_348',['Exception',['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a59759ca13add62a2bdd1fb7605d675dc',1,'cv::Exception::Exception()'],['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a95c2117604b1d51c17e5ccd540f448b9',1,'cv::Exception::Exception(int _code, const String &_err, const String &_func, const String &_file, int _line)']]], - ['exception_2eh_349',['exception.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00329.html',1,'']]], - ['exception_2ehpp_350',['exception.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01118.html',1,'']]], - ['exception_5fdefines_2eh_351',['exception_defines.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00332.html',1,'']]], - ['exception_5fptr_352',['exception_ptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05491.html',1,'std::__exception_ptr']]], - ['exception_5fptr_2eh_353',['exception_ptr.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00335.html',1,'']]], - ['exception_5fptr_2ehpp_354',['exception_ptr.hpp',['https://docs.opencv.org/4.2.0/dc/d0b/exception__ptr_8hpp.html',1,'']]], - ['exceptions_355',['exceptions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'basic_ios< char, _Traits >::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'basic_ios< char, _Traits >::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'basic_iostream< char >::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'basic_iostream< char >::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'basic_istream< char >::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'basic_istream< char >::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'basic_istream< char, _Traits >::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'basic_istream< char, _Traits >::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'basic_ostream< char >::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'basic_ostream< char >::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'basic_ostream< char, _Traits >::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'basic_ostream< char, _Traits >::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_fstream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_fstream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_ifstream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_ifstream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_ios::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_ios::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_iostream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_iostream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_istream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_istream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_istringstream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_istringstream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_ofstream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_ofstream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_ostream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_ostream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_ostringstream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_ostringstream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_stringstream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_stringstream::exceptions(iostate __except)']]], - ['exceptions_356',['Exceptions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01533.html',1,'Exceptions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html',1,'Exceptions']]], - ['exchange_357',['exchange',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a38a02a658328c056688ab79c7ab7bbf6',1,'std']]], - ['exec_5fkernel_358',['EXEC_KERNEL',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a3d1e337952cb697c25cde44a97112646acc62899c052a7270c485b7f13b80decb',1,'cv::ocl::Device']]], - ['exec_5fnative_5fkernel_359',['EXEC_NATIVE_KERNEL',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a3d1e337952cb697c25cde44a97112646a24f564396eb16e7ba60abaa27c0f36a7',1,'cv::ocl::Device']]], - ['executioncapabilities_360',['executionCapabilities',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a22d4914fb1618bf5d0e01e23320f45af',1,'cv::ocl::Device']]], - ['existingvertexgain_361',['existingVertexGain',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a0befaa37a55a449fd0f6cca94b5ed039',1,'cv::CirclesGridFinderParameters']]], - ['exists_362',['exists',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#a121000e13a76df1f238633a34281544d',1,'cv::utils::fs']]], - ['exp_363',['exp',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a70901e189e876f64d7f3fee1dbe942cc',1,'Eigen::MatrixBase::exp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a70901e189e876f64d7f3fee1dbe942cc',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::exp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a70901e189e876f64d7f3fee1dbe942cc',1,'MatrixBase< Solve< Decomposition, RhsType > >::exp()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga1eb07a682abff20e0864104599c06fbc',1,'cv::exp(const softfloat &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga21c119788f779f9e631161ffa354bbe5',1,'cv::exp(const softdouble &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3e10108e2162c338f1b848af619f39e5',1,'cv::exp(InputArray src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gac6e51541d3bb0a7a396128e4d5919b61',1,'cv::cuda::exp()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2377d17f34d96b5f90f3b1784aadc35d',1,'cv::cudev::exp(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b358174009d257885162cb85b03b10b',1,'cv::cudev::exp(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbd9e2a1dbb91a8a01cf96a874240944',1,'cv::cudev::exp(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga238d045995de8c2d718d1c9db47b7782',1,'cv::cudev::exp(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d30ba4a9e173be4de55e08e5bbb2c6a',1,'cv::cudev::exp(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae05e5efc45f1df3f5eed0ff20518e979',1,'cv::cudev::exp(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6225d1b57fb5da5dba8235a9c4e857e',1,'cv::cudev::exp(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40e6779d89d96440297b1721951bf84b',1,'cv::cudev::exp(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3936a08d28214eaca4bff1697eb439f',1,'cv::cudev::exp(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab49a7cb8733a9b4a91f4714992648600',1,'cv::cudev::exp(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1a77bcf816c20e9632c673001f281a0',1,'cv::cudev::exp(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9abd1ce69af14655baf0066944c2e2e4',1,'cv::cudev::exp(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5ca8ce32340a164855907fd13745e9c',1,'cv::cudev::exp(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0582d9c40b908171cecc7125aabcbb5d',1,'cv::cudev::exp(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d65f98c9682e2f343c12a3d78aec659',1,'cv::cudev::exp(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c75c53ddef77b4dde48324a8586de0c',1,'cv::cudev::exp(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ba751a8e12763b2ae5aa1be00b37a4e',1,'cv::cudev::exp(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54bc788ca46283afd03d58dc874e7388',1,'cv::cudev::exp(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b0db52fc67c721428bf8ee87d826f45',1,'cv::cudev::exp(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad41463837e6bdf4dd027b2ad1338b1df',1,'cv::cudev::exp(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2060dac1ca605f356217a1a7218f03b',1,'cv::cudev::exp(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa96ec0c7b40b32edd894e8eb0dd1e739',1,'cv::cudev::exp(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d0697aef6fb1e0eeae961417ab75aa0',1,'cv::cudev::exp(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dd48c7f9c9403b89cab831a3630861f',1,'cv::cudev::exp(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9cb3d8d68295eb8790f703a3a3960c2',1,'cv::cudev::exp(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fa2016a9697a2596f36d3ba7cebc9e0',1,'cv::cudev::exp(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada227385730cf553185f701c3eb4e0b',1,'cv::cudev::exp(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1ec67b22125821a631e92b145e0e9f',1,'cv::cudev::exp(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5123c41d3e50fcf7b7a9c33f897ca7a',1,'cv::cudev::exp(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f770d0cffaa71a1684699e619e67c84',1,'cv::cudev::exp(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32059ab5b7bb5109be82136693e50968',1,'cv::cudev::exp(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1196db753b3bb292dd414c58c750c2f',1,'cv::cudev::exp(const double4 &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3e10108e2162c338f1b848af619f39e5',1,'exp(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga1eb07a682abff20e0864104599c06fbc',1,'exp(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga21c119788f779f9e631161ffa354bbe5',1,'exp(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gac6e51541d3bb0a7a396128e4d5919b61',1,'exp(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2377d17f34d96b5f90f3b1784aadc35d',1,'exp(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b358174009d257885162cb85b03b10b',1,'exp(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbd9e2a1dbb91a8a01cf96a874240944',1,'exp(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga238d045995de8c2d718d1c9db47b7782',1,'exp(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d30ba4a9e173be4de55e08e5bbb2c6a',1,'exp(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae05e5efc45f1df3f5eed0ff20518e979',1,'exp(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6225d1b57fb5da5dba8235a9c4e857e',1,'exp(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40e6779d89d96440297b1721951bf84b',1,'exp(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3936a08d28214eaca4bff1697eb439f',1,'exp(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab49a7cb8733a9b4a91f4714992648600',1,'exp(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1a77bcf816c20e9632c673001f281a0',1,'exp(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9abd1ce69af14655baf0066944c2e2e4',1,'exp(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5ca8ce32340a164855907fd13745e9c',1,'exp(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0582d9c40b908171cecc7125aabcbb5d',1,'exp(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d65f98c9682e2f343c12a3d78aec659',1,'exp(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c75c53ddef77b4dde48324a8586de0c',1,'exp(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ba751a8e12763b2ae5aa1be00b37a4e',1,'exp(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54bc788ca46283afd03d58dc874e7388',1,'exp(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b0db52fc67c721428bf8ee87d826f45',1,'exp(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad41463837e6bdf4dd027b2ad1338b1df',1,'exp(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2060dac1ca605f356217a1a7218f03b',1,'exp(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa96ec0c7b40b32edd894e8eb0dd1e739',1,'exp(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d0697aef6fb1e0eeae961417ab75aa0',1,'exp(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dd48c7f9c9403b89cab831a3630861f',1,'exp(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9cb3d8d68295eb8790f703a3a3960c2',1,'exp(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fa2016a9697a2596f36d3ba7cebc9e0',1,'exp(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada227385730cf553185f701c3eb4e0b',1,'exp(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1ec67b22125821a631e92b145e0e9f',1,'exp(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5123c41d3e50fcf7b7a9c33f897ca7a',1,'exp(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f770d0cffaa71a1684699e619e67c84',1,'exp(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32059ab5b7bb5109be82136693e50968',1,'exp(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1196db753b3bb292dd414c58c750c2f',1,'exp(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga89579637d83fe041c9963cdcab272edd',1,'std::exp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga89579637d83fe041c9963cdcab272edd',1,'exp()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae491aecf7dab66ac7e11008c5766694d',1,'Eigen::exp()']]], - ['exp10_364',['exp10',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e8d8445d8ba8494f34353953065d05f',1,'cv::cudev::exp10(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada34819d02d15ad7db15a47d89df00d4',1,'cv::cudev::exp10(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1fffbb175f687b77191fb3d8dd685db',1,'cv::cudev::exp10(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdeb7dcb1a21bd9bccb13077611b8308',1,'cv::cudev::exp10(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4a3c09f0eded1c171575e81b36de72',1,'cv::cudev::exp10(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51d734d6b73b0247a35adcade02ab63',1,'cv::cudev::exp10(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga942543d60f12bf35f3dc205f2b590136',1,'cv::cudev::exp10(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac04817f53b09461b85df37d40ac26fba',1,'cv::cudev::exp10(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga740dbfd512f4b532c2e43b9502548489',1,'cv::cudev::exp10(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46b05046ddd286b98c2512bd85dbb640',1,'cv::cudev::exp10(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac64053203d70b199ce495f0da2201079',1,'cv::cudev::exp10(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22ab0a16ea4d467fd2fec0fd03b2462d',1,'cv::cudev::exp10(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18635fa94383efa3b5a2aab90d10b6ea',1,'cv::cudev::exp10(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d67bf499b08d68208c2439f85a6639',1,'cv::cudev::exp10(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09482b0315238fd82dba615ab0ff35fd',1,'cv::cudev::exp10(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5859bab52316181a06497a34ba4adc61',1,'cv::cudev::exp10(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1698e5efac86374421dbb69f4142980',1,'cv::cudev::exp10(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74967e8c51deea918e741ea497d01c4f',1,'cv::cudev::exp10(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga939ec6f7b0daeddf0431015b99aaee27',1,'cv::cudev::exp10(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cf829e6396673dc7642446cc0206f1',1,'cv::cudev::exp10(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d5880cfcd44f375b03416cbff831560',1,'cv::cudev::exp10(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60351faa9a42c500ea9ff576a9ccc273',1,'cv::cudev::exp10(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad313e1636031d9f548abcb0dd3fb204a',1,'cv::cudev::exp10(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga645e621b4728b1017a0c663056f3afca',1,'cv::cudev::exp10(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e6f286caaca38d2ad0daa42319c0dbb',1,'cv::cudev::exp10(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4e2ac6e27ff0e5fb0a09c3d5741fae4',1,'cv::cudev::exp10(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83446bcd25b7f39d772539762f14867d',1,'cv::cudev::exp10(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a3b221843fb0fcf237dcd570a7cfcd5',1,'cv::cudev::exp10(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga702225daf1f8936a522bdc7c8af86cca',1,'cv::cudev::exp10(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e050d8f01de4d68e8d6c05e791ce672',1,'cv::cudev::exp10(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea63381243afdf21499c465336b17772',1,'cv::cudev::exp10(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8577a71d688dbd8f61cc3313a6099a13',1,'cv::cudev::exp10(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e8d8445d8ba8494f34353953065d05f',1,'exp10(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada34819d02d15ad7db15a47d89df00d4',1,'exp10(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1fffbb175f687b77191fb3d8dd685db',1,'exp10(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdeb7dcb1a21bd9bccb13077611b8308',1,'exp10(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4a3c09f0eded1c171575e81b36de72',1,'exp10(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51d734d6b73b0247a35adcade02ab63',1,'exp10(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga942543d60f12bf35f3dc205f2b590136',1,'exp10(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac04817f53b09461b85df37d40ac26fba',1,'exp10(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga740dbfd512f4b532c2e43b9502548489',1,'exp10(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46b05046ddd286b98c2512bd85dbb640',1,'exp10(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac64053203d70b199ce495f0da2201079',1,'exp10(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22ab0a16ea4d467fd2fec0fd03b2462d',1,'exp10(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18635fa94383efa3b5a2aab90d10b6ea',1,'exp10(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d67bf499b08d68208c2439f85a6639',1,'exp10(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09482b0315238fd82dba615ab0ff35fd',1,'exp10(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5859bab52316181a06497a34ba4adc61',1,'exp10(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1698e5efac86374421dbb69f4142980',1,'exp10(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74967e8c51deea918e741ea497d01c4f',1,'exp10(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga939ec6f7b0daeddf0431015b99aaee27',1,'exp10(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cf829e6396673dc7642446cc0206f1',1,'exp10(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d5880cfcd44f375b03416cbff831560',1,'exp10(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60351faa9a42c500ea9ff576a9ccc273',1,'exp10(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad313e1636031d9f548abcb0dd3fb204a',1,'exp10(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga645e621b4728b1017a0c663056f3afca',1,'exp10(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e6f286caaca38d2ad0daa42319c0dbb',1,'exp10(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4e2ac6e27ff0e5fb0a09c3d5741fae4',1,'exp10(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83446bcd25b7f39d772539762f14867d',1,'exp10(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a3b221843fb0fcf237dcd570a7cfcd5',1,'exp10(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga702225daf1f8936a522bdc7c8af86cca',1,'exp10(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e050d8f01de4d68e8d6c05e791ce672',1,'exp10(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea63381243afdf21499c465336b17772',1,'exp10(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8577a71d688dbd8f61cc3313a6099a13',1,'exp10(const double4 &a)(Global Namespace)']]], - ['exp10_5f_365',['exp10_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac54b1a240e793afb049c168db401bf18',1,'cv::cudev::exp10_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac54b1a240e793afb049c168db401bf18',1,'exp10_()(Global Namespace)']]], - ['exp10_5ffunc_366',['exp10_func',['https://docs.opencv.org/4.2.0/dc/d8b/structcv_1_1cudev_1_1exp10__func.html',1,'cv::cudev']]], - ['exp10_5ffunc_3c_20double_20_3e_367',['exp10_func< double >',['https://docs.opencv.org/4.2.0/d0/d66/structcv_1_1cudev_1_1exp10__func_3_01double_01_4.html',1,'cv::cudev']]], - ['exp10_5ffunc_3c_20float_20_3e_368',['exp10_func< float >',['https://docs.opencv.org/4.2.0/d4/d78/structcv_1_1cudev_1_1exp10__func_3_01float_01_4.html',1,'cv::cudev']]], - ['exp10_5ffunc_3c_20schar_20_3e_369',['exp10_func< schar >',['https://docs.opencv.org/4.2.0/d6/dde/structcv_1_1cudev_1_1exp10__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['exp10_5ffunc_3c_20short_20_3e_370',['exp10_func< short >',['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1exp10__func_3_01short_01_4.html',1,'cv::cudev']]], - ['exp10_5ffunc_3c_20uchar_20_3e_371',['exp10_func< uchar >',['https://docs.opencv.org/4.2.0/d1/ddd/structcv_1_1cudev_1_1exp10__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['exp10_5ffunc_3c_20uint_20_3e_372',['exp10_func< uint >',['https://docs.opencv.org/4.2.0/d5/dc3/structcv_1_1cudev_1_1exp10__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['exp10_5ffunc_3c_20ushort_20_3e_373',['exp10_func< ushort >',['https://docs.opencv.org/4.2.0/d4/da4/structcv_1_1cudev_1_1exp10__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['exp2_374',['exp2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9b7aa19a64d7bcbca413f4f4d8d2cf2',1,'cv::cudev::exp2(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf3968a555f44ca7132a8c2c8b3f57b5',1,'cv::cudev::exp2(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ea3b79c9d61492a57fe3e2c4d3fe5ae',1,'cv::cudev::exp2(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab989dea5502f8e91da3ce610f235e0df',1,'cv::cudev::exp2(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45083bc0f533f599f81d75764907691b',1,'cv::cudev::exp2(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c11941f60a883451241900dd099c247',1,'cv::cudev::exp2(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd9b56a3b5be0cc0b0d56cdae02c7997',1,'cv::cudev::exp2(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac82f0768e06f8babc9a4fe930c76ae04',1,'cv::cudev::exp2(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0af32b7ffb0a4289aa399a151ae413b',1,'cv::cudev::exp2(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1283b9dc5979601664c1e853d6621c3f',1,'cv::cudev::exp2(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3deed18ea8891632503291df38b7beee',1,'cv::cudev::exp2(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f959da99631ae34637a0260e799e764',1,'cv::cudev::exp2(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e114d6062e2d9f61881a4fd21449d18',1,'cv::cudev::exp2(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07d572e6e4d6776518d1a8925e75e76f',1,'cv::cudev::exp2(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5ebe0f69bcafbe346c0b2bcc128e2df',1,'cv::cudev::exp2(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c40e6fde70f04a3ef05f12c160d468d',1,'cv::cudev::exp2(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43945f5444ae297ed58552731b5d632d',1,'cv::cudev::exp2(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf552f30a3d4cca247ff15108f7b96f72',1,'cv::cudev::exp2(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77cb9fcafeb63854be7f1dc522232a6b',1,'cv::cudev::exp2(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaad136d6b4eed3f770b151e8977b6ee4',1,'cv::cudev::exp2(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92dd79ef4f5710467fe2c9f16caee2ce',1,'cv::cudev::exp2(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47d823d1e258fdd14bdbf90ccc0659f7',1,'cv::cudev::exp2(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga525418a284d82325041fc2cdc3d0a809',1,'cv::cudev::exp2(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30aa1bdd46990cec246e4f719fadbb2b',1,'cv::cudev::exp2(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95126b77d73ae635289029cf4741a3ff',1,'cv::cudev::exp2(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b46ad8b62f94727aa47362edad8a74',1,'cv::cudev::exp2(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395ce17064a9546a41c07de53ed639d8',1,'cv::cudev::exp2(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc9b37e507c31c8ed9f0283e9c4d9a9d',1,'cv::cudev::exp2(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c71ac2024def7d833d369b1f98549c5',1,'cv::cudev::exp2(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f639ed805f238ccbc4145fd5edcde1c',1,'cv::cudev::exp2(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1f91ddf3cffefbde28e809522d10642',1,'cv::cudev::exp2(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9dc14185347dfd6f9b6d609e813e14e5',1,'cv::cudev::exp2(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9b7aa19a64d7bcbca413f4f4d8d2cf2',1,'exp2(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf3968a555f44ca7132a8c2c8b3f57b5',1,'exp2(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ea3b79c9d61492a57fe3e2c4d3fe5ae',1,'exp2(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab989dea5502f8e91da3ce610f235e0df',1,'exp2(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45083bc0f533f599f81d75764907691b',1,'exp2(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c11941f60a883451241900dd099c247',1,'exp2(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd9b56a3b5be0cc0b0d56cdae02c7997',1,'exp2(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac82f0768e06f8babc9a4fe930c76ae04',1,'exp2(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0af32b7ffb0a4289aa399a151ae413b',1,'exp2(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1283b9dc5979601664c1e853d6621c3f',1,'exp2(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3deed18ea8891632503291df38b7beee',1,'exp2(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f959da99631ae34637a0260e799e764',1,'exp2(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e114d6062e2d9f61881a4fd21449d18',1,'exp2(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07d572e6e4d6776518d1a8925e75e76f',1,'exp2(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5ebe0f69bcafbe346c0b2bcc128e2df',1,'exp2(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c40e6fde70f04a3ef05f12c160d468d',1,'exp2(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43945f5444ae297ed58552731b5d632d',1,'exp2(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf552f30a3d4cca247ff15108f7b96f72',1,'exp2(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77cb9fcafeb63854be7f1dc522232a6b',1,'exp2(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaad136d6b4eed3f770b151e8977b6ee4',1,'exp2(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92dd79ef4f5710467fe2c9f16caee2ce',1,'exp2(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47d823d1e258fdd14bdbf90ccc0659f7',1,'exp2(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga525418a284d82325041fc2cdc3d0a809',1,'exp2(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30aa1bdd46990cec246e4f719fadbb2b',1,'exp2(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95126b77d73ae635289029cf4741a3ff',1,'exp2(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b46ad8b62f94727aa47362edad8a74',1,'exp2(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395ce17064a9546a41c07de53ed639d8',1,'exp2(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc9b37e507c31c8ed9f0283e9c4d9a9d',1,'exp2(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c71ac2024def7d833d369b1f98549c5',1,'exp2(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f639ed805f238ccbc4145fd5edcde1c',1,'exp2(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1f91ddf3cffefbde28e809522d10642',1,'exp2(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9dc14185347dfd6f9b6d609e813e14e5',1,'exp2(const double1 &a)(Global Namespace)']]], - ['exp2_5f_375',['exp2_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab158beace2700c9cbce864f538c0a563',1,'cv::cudev::exp2_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab158beace2700c9cbce864f538c0a563',1,'exp2_()(Global Namespace)']]], - ['exp2_5ffunc_376',['exp2_func',['https://docs.opencv.org/4.2.0/dc/dd9/structcv_1_1cudev_1_1exp2__func.html',1,'cv::cudev']]], - ['exp2_5ffunc_3c_20double_20_3e_377',['exp2_func< double >',['https://docs.opencv.org/4.2.0/d8/d9b/structcv_1_1cudev_1_1exp2__func_3_01double_01_4.html',1,'cv::cudev']]], - ['exp2_5ffunc_3c_20float_20_3e_378',['exp2_func< float >',['https://docs.opencv.org/4.2.0/d8/dc7/structcv_1_1cudev_1_1exp2__func_3_01float_01_4.html',1,'cv::cudev']]], - ['exp2_5ffunc_3c_20schar_20_3e_379',['exp2_func< schar >',['https://docs.opencv.org/4.2.0/de/da5/structcv_1_1cudev_1_1exp2__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['exp2_5ffunc_3c_20short_20_3e_380',['exp2_func< short >',['https://docs.opencv.org/4.2.0/da/d29/structcv_1_1cudev_1_1exp2__func_3_01short_01_4.html',1,'cv::cudev']]], - ['exp2_5ffunc_3c_20uchar_20_3e_381',['exp2_func< uchar >',['https://docs.opencv.org/4.2.0/d2/d8b/structcv_1_1cudev_1_1exp2__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['exp2_5ffunc_3c_20uint_20_3e_382',['exp2_func< uint >',['https://docs.opencv.org/4.2.0/dc/dd4/structcv_1_1cudev_1_1exp2__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['exp2_5ffunc_3c_20ushort_20_3e_383',['exp2_func< ushort >',['https://docs.opencv.org/4.2.0/d9/d30/structcv_1_1cudev_1_1exp2__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['exp32f_384',['exp32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaaa6369f0c58d52fb7faca9d2b697479f',1,'cv::hal::exp32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaaa6369f0c58d52fb7faca9d2b697479f',1,'exp32f()(Global Namespace)']]], - ['exp64f_385',['exp64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6cbf3e40dc9952420ab8ef0a32d74f79',1,'cv::hal::exp64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6cbf3e40dc9952420ab8ef0a32d74f79',1,'exp64f()(Global Namespace)']]], - ['exp_5f_386',['exp_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22661f46425f6c9fe8d7a164c043ffb5',1,'cv::cudev::exp_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22661f46425f6c9fe8d7a164c043ffb5',1,'exp_()(Global Namespace)']]], - ['exp_5ffunc_387',['exp_func',['https://docs.opencv.org/4.2.0/dc/d73/structcv_1_1cudev_1_1exp__func.html',1,'cv::cudev']]], - ['exp_5ffunc_3c_20double_20_3e_388',['exp_func< double >',['https://docs.opencv.org/4.2.0/dd/db1/structcv_1_1cudev_1_1exp__func_3_01double_01_4.html',1,'cv::cudev']]], - ['exp_5ffunc_3c_20float_20_3e_389',['exp_func< float >',['https://docs.opencv.org/4.2.0/df/dba/structcv_1_1cudev_1_1exp__func_3_01float_01_4.html',1,'cv::cudev']]], - ['exp_5ffunc_3c_20schar_20_3e_390',['exp_func< schar >',['https://docs.opencv.org/4.2.0/d1/d33/structcv_1_1cudev_1_1exp__func_3_01schar_01_4.html',1,'cv::cudev']]], - ['exp_5ffunc_3c_20short_20_3e_391',['exp_func< short >',['https://docs.opencv.org/4.2.0/d7/d67/structcv_1_1cudev_1_1exp__func_3_01short_01_4.html',1,'cv::cudev']]], - ['exp_5ffunc_3c_20uchar_20_3e_392',['exp_func< uchar >',['https://docs.opencv.org/4.2.0/d9/de4/structcv_1_1cudev_1_1exp__func_3_01uchar_01_4.html',1,'cv::cudev']]], - ['exp_5ffunc_3c_20uint_20_3e_393',['exp_func< uint >',['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1exp__func_3_01uint_01_4.html',1,'cv::cudev']]], - ['exp_5ffunc_3c_20ushort_20_3e_394',['exp_func< ushort >',['https://docs.opencv.org/4.2.0/d6/dde/structcv_1_1cudev_1_1exp__func_3_01ushort_01_4.html',1,'cv::cudev']]], - ['expand_395',['expand',['https://docs.opencv.org/4.2.0/db/d27/structcv_1_1detail_1_1GCompoundCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01stdce2f32b5f5ee035f9c558a4fd2328de5.html#a3088ea01f13ee8d581eeb189670388b7',1,'cv::detail::GCompoundCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... > >']]], - ['expand_5fimpl_396',['expand_impl',['https://docs.opencv.org/4.2.0/db/d27/structcv_1_1detail_1_1GCompoundCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01stdce2f32b5f5ee035f9c558a4fd2328de5.html#a316f2951af9e7448ebc5ab4e81df3b0d',1,'cv::detail::GCompoundCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... > >']]], - ['expand_5fmat_397',['expand_mat',['https://docs.opencv.org/4.2.0/d6/d84/namespacecv_1_1quality_1_1quality__utils.html#a4bc8e62e8ba688115623e6e09affbdef',1,'cv::quality::quality_utils']]], - ['expanded_5fmat_5fdefault_5ftype_398',['EXPANDED_MAT_DEFAULT_TYPE',['https://docs.opencv.org/4.2.0/d6/d84/namespacecv_1_1quality_1_1quality__utils.html#af9e2ce343214a7e11a94f84d71b86d9d',1,'cv::quality::quality_utils']]], - ['experimental_399',['Experimental',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01524.html',1,'']]], - ['experimental_202d_20features_20algorithms_400',['Experimental 2D Features Algorithms',['https://docs.opencv.org/4.2.0/d7/d7a/group__xfeatures2d__experiment.html',1,'']]], - ['experimental_202d_20features_20matching_20algorithm_401',['Experimental 2D Features Matching Algorithm',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html',1,'']]], - ['experimental_20parts_20of_20eigen_402',['Experimental parts of Eigen',['https://eigen.tuxfamily.org/dox/Experimental.html',1,'']]], - ['experimental_2falgorithm_403',['experimental/algorithm',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16583.html',1,'']]], - ['experimental_2farray_404',['experimental/array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16601.html',1,'']]], - ['experimental_2fbits_2ffs_5fdir_2eh_405',['experimental/bits/fs_dir.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16916.html',1,'']]], - ['experimental_2fbits_2ffs_5ffwd_2eh_406',['experimental/bits/fs_fwd.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16922.html',1,'']]], - ['experimental_2fbits_2ffs_5fpath_2eh_407',['experimental/bits/fs_path.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16934.html',1,'']]], - ['experimental_2fbits_2fshared_5fptr_2eh_408',['experimental/bits/shared_ptr.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17231.html',1,'']]], - ['experimental_2fbits_2fstring_5fview_2etcc_409',['experimental/bits/string_view.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17276.html',1,'']]], - ['experimental_2fchrono_410',['experimental/chrono',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16628.html',1,'']]], - ['experimental_2fdeque_411',['experimental/deque',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16808.html',1,'']]], - ['experimental_2fforward_5flist_412',['experimental/forward_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16910.html',1,'']]], - ['experimental_2ffunctional_413',['experimental/functional',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16940.html',1,'']]], - ['experimental_2fiterator_414',['experimental/iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17033.html',1,'']]], - ['experimental_2flist_415',['experimental/list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17063.html',1,'']]], - ['experimental_2fmap_416',['experimental/map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17072.html',1,'']]], - ['experimental_2fmemory_417',['experimental/memory',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17084.html',1,'']]], - ['experimental_2fnumeric_418',['experimental/numeric',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17126.html',1,'']]], - ['experimental_2frandom_419',['experimental/random',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17171.html',1,'']]], - ['experimental_2fratio_420',['experimental/ratio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17183.html',1,'']]], - ['experimental_2fregex_421',['experimental/regex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17186.html',1,'']]], - ['experimental_2fset_422',['experimental/set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17219.html',1,'']]], - ['experimental_2fstring_423',['experimental/string',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17270.html',1,'']]], - ['experimental_2fsystem_5ferror_424',['experimental/system_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17279.html',1,'']]], - ['experimental_2ftuple_425',['experimental/tuple',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17324.html',1,'']]], - ['experimental_2ftype_5ftraits_426',['experimental/type_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17330.html',1,'']]], - ['experimental_2funordered_5fmap_427',['experimental/unordered_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17339.html',1,'']]], - ['experimental_2funordered_5fset_428',['experimental/unordered_set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17348.html',1,'']]], - ['experimental_2futility_429',['experimental/utility',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17351.html',1,'']]], - ['experimental_2fvector_430',['experimental/vector',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17360.html',1,'']]], - ['expint_431',['expint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga88ba17f5d050a6973ca4db1bf6e90590',1,'std::expint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gac555d8d9bf9256070f2238a6a788727c',1,'std::tr1::expint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga88ba17f5d050a6973ca4db1bf6e90590',1,'expint(_Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gac555d8d9bf9256070f2238a6a788727c',1,'expint(_Tp __x)(Global Namespace)']]], - ['expintf_432',['expintf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga5842816f6eed2594e0a327df4e4a2a47',1,'std::expintf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga5842816f6eed2594e0a327df4e4a2a47',1,'expintf()(Global Namespace)']]], - ['expintl_433',['expintl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1329130b32328d0666e290ee5931fa4f',1,'std::expintl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1329130b32328d0666e290ee5931fa4f',1,'expintl(long double __x)(Global Namespace)']]], - ['explained_20with_20code_434',['Basic concepts of the homography explained with code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'']]], - ['explanation_20of_20the_20assertion_20on_20unaligned_20arrays_435',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], - ['expm1_436',['expm1',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae7cb2544e4e745bc0067fe793e3f2f81',1,'Eigen']]], - ['exponent_20calculation_437',['Exponent calculation',['https://docs.opencv.org/4.2.0/d4/d8a/group__core__hal__interface__exp.html',1,'']]], - ['exponential_5fdistribution_438',['exponential_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html',1,'std::exponential_distribution< _RealType >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a0d648c2fe97f6882eb362331d4fc4be9',1,'std::exponential_distribution::exponential_distribution()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a0da5c22c9ebe44479b181cce576f466e',1,'std::exponential_distribution::exponential_distribution(_RealType __lambda)']]], - ['exporting_20a_20template_20parameter_20file_439',['Exporting a template parameter file',['https://docs.opencv.org/4.2.0/df/dc0/tutorial_qds_export_parameters.html',1,'']]], - ['exports_2ehpp_440',['exports.hpp',['https://docs.opencv.org/4.2.0/da/dfe/exports_8hpp.html',1,'']]], - ['exposure_20compensation_441',['Exposure Compensation',['https://docs.opencv.org/4.2.0/dd/dff/group__stitching__exposure.html',1,'']]], - ['exposure_5fcompensate_2ehpp_442',['exposure_compensate.hpp',['https://docs.opencv.org/4.2.0/df/d70/exposure__compensate_8hpp.html',1,'']]], - ['exposurecompensator_443',['ExposureCompensator',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html',1,'cv::detail']]], - ['exposurecompensator_444',['exposureCompensator',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#afc646488ee47f87c743d3ab1e3832b48',1,'cv::Stitcher::exposureCompensator()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ab065fe029bb9b499c4d86c80741d0a2d',1,'cv::Stitcher::exposureCompensator() const']]], - ['exposurecompensator_445',['ExposureCompensator',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#abd2cbffa1c8be33a5740bc7f3f20d037',1,'cv::detail::ExposureCompensator']]], - ['expr_446',['Expr',['https://docs.opencv.org/4.2.0/de/dfb/structcv_1_1cudev_1_1Expr.html',1,'cv::cudev']]], - ['expr_447',['EXPR',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba84ed741d208c2de3eaa9658ce1554379',1,'cv::_InputArray']]], - ['expr_2ehpp_448',['expr.hpp',['https://docs.opencv.org/4.2.0/d8/d01/expr_8hpp.html',1,'']]], - ['expression_20templates_20in_20eigen_449',['Expression templates in Eigen',['https://eigen.tuxfamily.org/dox/TopicEigenExpressionTemplates.html',1,'']]], - ['expression_20type_450',['Adding a new expression type',['https://eigen.tuxfamily.org/dox/TopicNewExpressionType.html',1,'']]], - ['expressions_451',['Matrix manipulation via nullary-expressions',['https://eigen.tuxfamily.org/dox/TopicCustomizing_NullaryExpr.html',1,'']]], - ['expressions_452',['Regular Expressions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html',1,'']]], - ['expressions_453',['Writing efficient matrix product expressions',['https://eigen.tuxfamily.org/dox/TopicWritingEfficientProductExpression.html',1,'']]], - ['ext_2falgorithm_454',['ext/algorithm',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16577.html',1,'']]], - ['ext_2falloc_5ftraits_2eh_455',['ext/alloc_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16595.html',1,'']]], - ['ext_2fcmath_456',['ext/cmath',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16637.html',1,'']]], - ['ext_2ffunctional_457',['ext/functional',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16937.html',1,'']]], - ['ext_2fiterator_458',['ext/iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17030.html',1,'']]], - ['ext_2fmemory_459',['ext/memory',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17081.html',1,'']]], - ['ext_2fnumeric_460',['ext/numeric',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17120.html',1,'']]], - ['ext_2frandom_2etcc_461',['ext/random.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17177.html',1,'']]], - ['extc_2b_2b_2eh_462',['extc++.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00692.html',1,'']]], - ['extend_463',['extend',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a0ca284f3375f68b9e9aef558cd5bcd37',1,'Eigen::AlignedBox::extend(const AlignedBox &b)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ac252032292dcf60984191e4dd26f0955',1,'Eigen::AlignedBox::extend(const MatrixBase< Derived > &p)']]], - ['extended_464',['extended',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a634659515f412d8659bd449f8cdb6abf',1,'cv::cuda::SURF_CUDA::extended'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#af6c55a7ee994437667dd9b8b5a0580e0',1,'std::regex_constants::extended']]], - ['extended_20image_20processing_465',['Extended Image Processing',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html',1,'']]], - ['extended_20object_20detection_466',['Extended object detection',['https://docs.opencv.org/4.2.0/d4/d54/group__xobjdetect.html',1,'']]], - ['extendedkalmanfilter_467',['ExtendedKalmanFilter',['../classfilters_1_1ExtendedKalmanFilter.html',1,'filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >'],['../classfilters_1_1ExtendedKalmanFilter.html#afca45e49eb1884f7e801bfea0a015f51',1,'filters::ExtendedKalmanFilter::ExtendedKalmanFilter()']]], - ['extending_20customizing_20eigen_468',['Extending/Customizing Eigen',['https://eigen.tuxfamily.org/dox/UserManual_CustomizingEigen.html',1,'']]], - ['extending_20matrixbase_20and_20other_20classes_469',['Extending MatrixBase (and other classes)',['https://eigen.tuxfamily.org/dox/TopicCustomizing_Plugins.html',1,'']]], - ['extensions_470',['extensions',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a963606957c52e6ca0b58de3f63afa309',1,'cv::ocl::Device']]], - ['extensions_471',['Extensions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01467.html',1,'']]], - ['extent_472',['extent',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03515.html',1,'std']]], - ['exteriordistance_473',['exteriorDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#afb3b43bab1d84a95e7a515ca854cda70',1,'Eigen::AlignedBox::exteriorDistance(const AlignedBox &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a3915f625f0e57029ea27ace34aff29b2',1,'Eigen::AlignedBox::exteriorDistance(const MatrixBase< Derived > &p) const']]], - ['external_20libraries_20plugins_474',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], - ['external_5fload_5faccess_475',['external_load_access',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#afd8e1e7947fd32043e5a161234d6bb8cabc495279215d973cef60eeedf09f5a70',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::external_load_access'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11159.html#a05e423b5b9d07f35207c370d62f499caa8dad02122f698bdbd58666bcbc3fdf62',1,'__gnu_pbds::hash_load_check_resize_trigger::external_load_access']]], - ['extobject_476',['ExtObject',['https://docs.opencv.org/4.2.0/d1/dda/structcv_1_1DetectionBasedTracker_1_1ExtObject.html',1,'cv::DetectionBasedTracker::ExtObject'],['https://docs.opencv.org/4.2.0/d1/dda/structcv_1_1DetectionBasedTracker_1_1ExtObject.html#af8b8156ac58ff52667da607466c1e018',1,'cv::DetectionBasedTracker::ExtObject::ExtObject()']]], - ['extptr_5fallocator_2eh_477',['extptr_allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01052.html',1,'']]], - ['extra_202d_20features_20framework_478',['Extra 2D Features Framework',['https://docs.opencv.org/4.2.0/d1/db4/group__xfeatures2d.html',1,'']]], - ['extract_479',['extract',['https://docs.opencv.org/4.2.0/d7/d8d/classcv_1_1cnn__3dobj_1_1descriptorExtractor.html#a99358bae501ac83551a2abd0d2a370b4',1,'cv::cnn_3dobj::descriptorExtractor']]], - ['extract_20horizontal_20and_20vertical_20lines_20by_20using_20morphological_20operations_480',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], - ['extract_5fmat_481',['extract_mat',['https://docs.opencv.org/4.2.0/d6/d84/namespacecv_1_1quality_1_1quality__utils.html#ae3019e362fe2aab8d86e7bca8c8064e4',1,'cv::quality::quality_utils']]], - ['extract_5fthreshold_482',['extract_threshold',['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#ad5307fc9b814b8705f058faf89c22186',1,'cv::linemod::DepthNormal']]], - ['extractchannel_483',['extractChannel',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gacc6158574aa1f0281878c955bcf35642',1,'cv::extractChannel()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gacc6158574aa1f0281878c955bcf35642',1,'extractChannel(InputArray src, OutputArray dst, int coi)(Global Namespace)']]], - ['extracted_20from_20an_20image_484',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], - ['extraction_485',['extraction',['https://docs.opencv.org/4.2.0/dc/da7/classcv_1_1TrackerFeatureSet.html#aac55db0d383a61e70f4d06639948c40d',1,'cv::TrackerFeatureSet']]], - ['extraction_20using_20grabcut_20algorithm_486',['Extraction using GrabCut Algorithm',['https://docs.opencv.org/4.2.0/dd/dfc/tutorial_js_grabcut.html',1,'Foreground Extraction using GrabCut Algorithm'],['https://docs.opencv.org/4.2.0/d8/d83/tutorial_py_grabcut.html',1,'Interactive Foreground Extraction using GrabCut Algorithm']]], - ['extractselected_487',['extractSelected',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a534412a37c6f3f12d2356c0a7aeb040c',1,'cv::TrackerFeatureHAAR']]], - ['extractsimplefeatures_488',['extractSimpleFeatures',['https://docs.opencv.org/4.2.0/d4/d3b/classcv_1_1xphoto_1_1LearningBasedWB.html#aeeaca052262a01d0feed6312ccb9a76e',1,'cv::xphoto::LearningBasedWB']]], - ['extracttemplate_489',['extractTemplate',['https://docs.opencv.org/4.2.0/d7/d6f/classcv_1_1linemod_1_1QuantizedPyramid.html#a258730f1ea19c812d092eaff325b8457',1,'cv::linemod::QuantizedPyramid']]], - ['extrapolation_2ehpp_490',['extrapolation.hpp',['https://docs.opencv.org/4.2.0/d4/d28/extrapolation_8hpp.html',1,'']]], - ['extreme_5fvalue_5fdistribution_491',['extreme_value_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html',1,'std']]], - ['extrinsicparams_492',['extrinsicParams',['../structcam_1_1CameraConfig.html#a33cbe320899f227ff3f3e631a2bbd696',1,'cam::CameraConfig']]], - ['eye_493',['eye',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a2cf9b9acde7a9852542bbc20ef851ed2',1,'cv::Mat::eye(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aab87b56e1dc370ffe4afb735b6a1e5c9',1,'cv::Mat::eye(Size size, int type)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a992daefd1a256fbd40423a2cf77f42a1',1,'cv::Mat_::eye(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4b16819512990144b9f0d0b76758f491',1,'cv::Mat_::eye(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a992daefd1a256fbd40423a2cf77f42a1',1,'Mat_< double >::eye(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4b16819512990144b9f0d0b76758f491',1,'Mat_< double >::eye(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a992daefd1a256fbd40423a2cf77f42a1',1,'Mat_< float >::eye(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4b16819512990144b9f0d0b76758f491',1,'Mat_< float >::eye(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a992daefd1a256fbd40423a2cf77f42a1',1,'Mat_< uchar >::eye(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4b16819512990144b9f0d0b76758f491',1,'Mat_< uchar >::eye(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a992daefd1a256fbd40423a2cf77f42a1',1,'Mat_< unsigned char >::eye(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4b16819512990144b9f0d0b76758f491',1,'Mat_< unsigned char >::eye(Size size)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'cv::Matx::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< _Tp, cn, 1 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, 1, 3 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, 2, 2 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, 2, 3 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, 3, 3 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, 3, 4 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, 4, 4 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, cn, 1 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< float, 2, 3 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< float, 3, 3 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< float, cn, 1 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< float_type, 4, 4 >::eye()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a479e07ad4829b35b83f2aae7231d0ec6',1,'cv::UMat::eye(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a79a713e4c931aae8a8b13ec3c62326b9',1,'cv::UMat::eye(Size size, int type)']]] + ['empty_5farray_5fdesc_145',['empty_array_desc',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga0df8f238141fa6774a4b5098a6546130',1,'cv::empty_array_desc()'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga0df8f238141fa6774a4b5098a6546130',1,'empty_array_desc()(Global Namespace)']]], + ['empty_5fgmat_5fdesc_146',['empty_gmat_desc',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga47609b44d964009a7ec687a67551a6b5',1,'cv::empty_gmat_desc()'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#ga47609b44d964009a7ec687a67551a6b5',1,'empty_gmat_desc()(Global Namespace)']]], + ['empty_5fscalar_5fdesc_147',['empty_scalar_desc',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#gabcd7881f3d260006187e99c004b58863',1,'cv::empty_scalar_desc()'],['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html#gabcd7881f3d260006187e99c004b58863',1,'empty_scalar_desc()(Global Namespace)']]], + ['emulation_2ehpp_148',['emulation.hpp',['https://docs.opencv.org/4.2.0/dd/d0e/emulation_8hpp.html',1,'']]], + ['enable_20halide_20backend_20for_20improve_20efficiency_149',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], + ['enable_5fif_150',['enable_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04251.html',1,'std']]], + ['enable_5fif_5ft_151',['enable_if_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#gaccc2a55dff256e901d69f67ef213d12c',1,'std::enable_if_t'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html#gaccc2a55dff256e901d69f67ef213d12c',1,'enable_if_t(Global Namespace)']]], + ['enable_5fshared_5ffrom_5fthis_152',['enable_shared_from_this',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06923.html',1,'std']]], + ['enable_5fspecial_5fmembers_2eh_153',['enable_special_members.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00323.html',1,'']]], + ['enablefusion_154',['enableFusion',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#af22e2f1a542d80ea797ba38902c726bd',1,'cv::dnn::Net']]], + ['enableif_155',['EnableIf',['https://docs.opencv.org/4.2.0/dd/d8b/structcv_1_1cudev_1_1EnableIf.html',1,'cv::cudev']]], + ['enc_5ffilebuf_156',['enc_filebuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10383.html',1,'__gnu_cxx']]], + ['enc_5ffilebuf_2eh_157',['enc_filebuf.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01049.html',1,'']]], + ['encode_5fframe_158',['encode_frame',['../classvideo_1_1H264Encoder.html#a53b3a6c6c495bbcbd100e37fabc7bf9a',1,'video::H264Encoder']]], + ['encoded_20image_159',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], + ['encodeparameters_160',['encodeParameters',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a2d2fdf1ab0543fd762b22c6b07a0056e',1,'cv::omnidir::internal']]], + ['encodeparametersstereo_161',['encodeParametersStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#afc0f36819f26738baa9a89f53985581d',1,'cv::omnidir::internal']]], + ['encoder_162',['Encoder',['../classh264encoder_1_1Encoder.html',1,'h264encoder']]], + ['encodercallback_163',['EncoderCallBack',['https://docs.opencv.org/4.2.0/d6/db6/classcv_1_1cudacodec_1_1EncoderCallBack.html',1,'cv::cudacodec']]], + ['encoderimpl_164',['EncoderImpl',['../classh264encoder_1_1EncoderImpl.html',1,'h264encoder']]], + ['encoderparams_165',['EncoderParams',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html',1,'cv::cudacodec::EncoderParams'],['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#aeb2b4fad493b471a9e9f6d55b3881e35',1,'cv::cudacodec::EncoderParams::EncoderParams()'],['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a16186217b07418ce48250d893c85e385',1,'cv::cudacodec::EncoderParams::EncoderParams(const String &configFile)']]], + ['encoding_20decoding_166',['Video Encoding/Decoding',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html',1,'']]], + ['encoding_5fchar_5ftraits_167',['encoding_char_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10331.html',1,'__gnu_cxx']]], + ['encoding_5fstate_168',['encoding_state',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10327.html',1,'__gnu_cxx']]], + ['encparams_5ft_169',['encparams_t',['../structrobot_1_1encparams__t.html',1,'robot']]], + ['end_170',['end',['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#aba16789fec81858a31c9685d399b62fc',1,'cv::Range::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'basic_ios< char, _Traits >::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'basic_iostream< char >::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'basic_istream< char >::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'basic_istream< char, _Traits >::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'basic_ostream< char >::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'basic_ostream< char, _Traits >::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_fstream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_ifstream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_ios::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_iostream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_istream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_istringstream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_ofstream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_ostream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_ostringstream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::basic_stringstream::end'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a505c3780386ccd5ca9679f7264db97f9',1,'std::ios_base::end'],['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html#ac8ce662bca842467e0cafb3f7f62b7fd',1,'cv::dnn::Dict::end()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a58b033e34726eb73f0238a1bfbe0c8e9',1,'cv::FileNode::end()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a9dd628eeccedea6e181ca54d41830a62',1,'cv::Mat::end()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a092f54359c99e42729715024fc662182',1,'cv::Mat::end() const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5e02060c1085a73a91d7fe9e8d2583a5',1,'cv::Mat_::end()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a83ac8f6851ed1b1c24091b6f1d619a6a',1,'cv::Mat_::end() const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5e02060c1085a73a91d7fe9e8d2583a5',1,'Mat_< double >::end()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a83ac8f6851ed1b1c24091b6f1d619a6a',1,'Mat_< double >::end() const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5e02060c1085a73a91d7fe9e8d2583a5',1,'Mat_< float >::end()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a83ac8f6851ed1b1c24091b6f1d619a6a',1,'Mat_< float >::end() const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5e02060c1085a73a91d7fe9e8d2583a5',1,'Mat_< uchar >::end()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a83ac8f6851ed1b1c24091b6f1d619a6a',1,'Mat_< uchar >::end() const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5e02060c1085a73a91d7fe9e8d2583a5',1,'Mat_< unsigned char >::end()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a83ac8f6851ed1b1c24091b6f1d619a6a',1,'Mat_< unsigned char >::end() const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a71cef837db3fd9aabef3abb57ae19a1b',1,'cv::SparseMat::end()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a4d3e2d01ec6a363488097ae2b0b3c124',1,'cv::SparseMat::end() const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a4fe2ca854bcafa54cb371146523c7e36',1,'cv::SparseMat::end()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ac004c4119d6e77bfa95e803d9a7dd5fd',1,'cv::SparseMat::end() const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a0d918c7287fdff2d82738667d066fabc',1,'cv::SparseMat_::end()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a7091eccbc3eed537f5ab12944ac61b3e',1,'cv::SparseMat_::end() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a0acafbbfa0d432074373506cc9ed631f',1,'__gnu_cxx::__versa_string::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac99321a98ffc407b9747352bec9551c2',1,'__gnu_cxx::__versa_string::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a0a05d06255dbcf619bb312133b13cc97',1,'__gnu_cxx::temporary_buffer::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09399.html#a8a0b6be67bf27256c7701980673775b6',1,'__gnu_parallel::_PseudoSequence::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12079.html#a91709489f927e5cfb388b57dd05d7f52',1,'__gnu_pbds::sample_trie_access_traits::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11363.html#af95db97b3bb5e9c70c5e4da927727e2d',1,'__gnu_pbds::trie_string_access_traits::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< _CharT >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< _CharT >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< _CharT, _Traits, _Allocator >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< _CharT, _Traits, _Allocator >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< char >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< char >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< char, char_traits< char >, _Byte_alloc >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< char_type, _Traits, _Alloc >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< char_type, _Traits, _Alloc >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'basic_string< value_type >::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'basic_string< value_type >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a78b2da6c6329349581db042e6bbe2a40',1,'deque< _StateSeqT >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ad1986c3313eec924e6a7531929a82b8d',1,'deque< _StateSeqT >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aba82f0b94c1ed15ccacea0e98aa6cff6',1,'list< __inp, __rebind_inp >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a39a7a20ed70dd4018608a3522d83124d',1,'list< __inp, __rebind_inp >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a90575e6de802e6c4a4999f7f3bb62047',1,'match_results< _Bi_iter >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'match_results< _Bi_iter >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a90575e6de802e6c4a4999f7f3bb62047',1,'match_results< _Bi_iter >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a0a05d06255dbcf619bb312133b13cc97',1,'std::_Temporary_buffer::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa4a6c059c158877d2390196bbff5b480',1,'std::basic_string::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a817beeb1801ef5c3046593ef8867a37d',1,'std::basic_string::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a78b2da6c6329349581db042e6bbe2a40',1,'std::deque::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ad1986c3313eec924e6a7531929a82b8d',1,'std::deque::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a7f64feff678dd8cb85d35bd9b08fde54',1,'std::forward_list::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a9a320037c76fc8f0e6f60784dcec1383',1,'std::forward_list::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aba82f0b94c1ed15ccacea0e98aa6cff6',1,'std::list::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a39a7a20ed70dd4018608a3522d83124d',1,'std::list::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a5dfaf89a89106d147fd055c313a291ee',1,'std::map::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a50d3bee624167086813c84cc5fbc0f8f',1,'std::map::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'std::match_results::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a90575e6de802e6c4a4999f7f3bb62047',1,'std::match_results::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ae02e2ac133d3d1753c3b57f5dfd435cc',1,'std::multimap::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a451671d828e1fc84f2a5631518b6d1f8',1,'std::multimap::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aff68f6029ff179bafdadc89212fe1ee0',1,'std::multiset::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a7a35e9e918f87c423c9f1f2362151b26',1,'std::set::end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a42872e15c417c6f944d019315553951e',1,'std::unordered_map::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab91675efcde6f50894587cdb2037a4fc',1,'std::unordered_map::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6b763e0c9c40786e19c26f5fa97e3ab6',1,'std::unordered_map::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a606977180c30d7a49a36846a45f4e355',1,'std::unordered_map::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6b763e0c9c40786e19c26f5fa97e3ab6',1,'std::unordered_map::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a606977180c30d7a49a36846a45f4e355',1,'std::unordered_map::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a708a8efab9b1b9d8f1e41ca3ae2caaa5',1,'std::unordered_multimap::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a4209ed9ce2c4549ded624445fa59416f',1,'std::unordered_multimap::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a0921ff9d001238f2f5b92f025378a37d',1,'std::unordered_multimap::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aa7cd9ddc32c88838cfcd1f2cc53ae5ab',1,'std::unordered_multimap::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a0921ff9d001238f2f5b92f025378a37d',1,'std::unordered_multimap::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aa7cd9ddc32c88838cfcd1f2cc53ae5ab',1,'std::unordered_multimap::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a8158b25dee0140da6e109a2592cec0eb',1,'std::unordered_multiset::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aaa3754e88e7218cbd97bad8024a9a20a',1,'std::unordered_multiset::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#adecae97e8a67ad9111c148bc6a85bde5',1,'std::unordered_multiset::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a38af28f07b44fa8ef5ee3ee4d5886762',1,'std::unordered_multiset::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a8158b25dee0140da6e109a2592cec0eb',1,'std::unordered_multiset::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aaa3754e88e7218cbd97bad8024a9a20a',1,'std::unordered_multiset::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#adecae97e8a67ad9111c148bc6a85bde5',1,'std::unordered_multiset::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a38af28f07b44fa8ef5ee3ee4d5886762',1,'std::unordered_multiset::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#aa28c45008761a27eecdaeefaab68fa0e',1,'std::unordered_set::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a9ead8905955f0942591a17d70f8405c8',1,'std::unordered_set::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a70a807c039d620efcfd2b96048c3471a',1,'std::unordered_set::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a124d7201aeadabc2a92e74fde00ec347',1,'std::unordered_set::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#aa28c45008761a27eecdaeefaab68fa0e',1,'std::unordered_set::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a9ead8905955f0942591a17d70f8405c8',1,'std::unordered_set::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a70a807c039d620efcfd2b96048c3471a',1,'std::unordered_set::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a124d7201aeadabc2a92e74fde00ec347',1,'std::unordered_set::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'std::vector::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'std::vector::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a42872e15c417c6f944d019315553951e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab91675efcde6f50894587cdb2037a4fc',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::end(size_type __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6b763e0c9c40786e19c26f5fa97e3ab6',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a606977180c30d7a49a36846a45f4e355',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a6b763e0c9c40786e19c26f5fa97e3ab6',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a606977180c30d7a49a36846a45f4e355',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::end(size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< __diff_type >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< __diff_type >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _CharClassT >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _CharClassT >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _CharT >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _CharT >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _Cmpt >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _Cmpt >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _Node *, _Nodeptr_Alloc >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _Node *, _Nodeptr_Alloc >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _RealType >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _RealType >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _State< _TraitsT::char_type > >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _State< _TraitsT::char_type > >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< _StringT >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< _StringT >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< block_type, allocator_type >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< block_type, allocator_type >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< Catalog_info * >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< Catalog_info * >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< double >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< double >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< int >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< int >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< result_type >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< result_type >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< size_t >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< size_t >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< std::pair< _BiIter, int > >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< std::pair< _BiIter, int > >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< std::pair< _StateIdT, std::vector > >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< std::pair< _StateIdT, std::vector > >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< std::pair< _StrTransT, _StrTransT > >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< std::pair< _StrTransT, _StrTransT > >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< sub_match< _Bi_iter >, _Alloc >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< sub_match< _Bi_iter >, _Alloc >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae957699b810eb3313916800773e103d7',1,'vector< sub_match< _BiIter >, _Alloc >::end() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#ae3d969a640523603b2c51341c975b30c',1,'vector< sub_match< _BiIter >, _Alloc >::end() const noexcept'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a69e683fcd5e46fc396ab4204061d66a8',1,'Eigen::DenseBase::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a69e683fcd5e46fc396ab4204061d66a8',1,'DenseBase< ArrayWrapper< ExpressionType > >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a69e683fcd5e46fc396ab4204061d66a8',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a69e683fcd5e46fc396ab4204061d66a8',1,'DenseBase< Solve< Decomposition, RhsType > >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'Eigen::VectorwiseOp::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'Eigen::VectorwiseOp::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const Derived, Horizontal >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const Derived, Horizontal >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const Derived, Vertical >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const Derived, Vertical >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::end() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9d189042b8322e40772d41c63b9d3bb5',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::end()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#ad3b0dcb34bb4903ffa1ab3634188ecff',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::end() const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a931267ec3f09eb67e4382f321b2c52bc.html#a931267ec3f09eb67e4382f321b2c52bc',1,'nlohmann::basic_json::end() noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a82b5b96f86879a3bac0c713d33178551.html#a82b5b96f86879a3bac0c713d33178551',1,'nlohmann::basic_json::end() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a11ed6eea7e5fa38dfb88d84bce3c16b9',1,'std::end(_Container &__cont) -> decltype(__cont.end())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad4f45049099b6f3387d8f542201d28d5',1,'std::end(const _Container &__cont) -> decltype(__cont.end())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab0db204cc11475513f0c7013ed51d406',1,'std::end(_Tp(&__arr)[_Nm])'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a579ff3807b61f57bda29d023b3918504',1,'std::end(initializer_list< _Tp > __ils) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga3541bf5385594aac72a9424aa6dd86e1',1,'std::end(valarray< _Tp > &__va)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab777d802b5dfa668d030039c2fd78b3b',1,'std::end(const valarray< _Tp > &__va)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga3541bf5385594aac72a9424aa6dd86e1',1,'end(valarray< _Tp > &__va)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab777d802b5dfa668d030039c2fd78b3b',1,'end(const valarray< _Tp > &__va)(Global Namespace)']]], + ['end_5farray_171',['end_array',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a235ee975617f28e6a996d1e36a282312.html#a235ee975617f28e6a996d1e36a282312',1,'nlohmann::json_sax']]], + ['end_5fobject_172',['end_object',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_ad0c722d53ff97be700ccf6a9468bd456.html#ad0c722d53ff97be700ccf6a9468bd456',1,'nlohmann::json_sax']]], + ['endianlittle_173',['endianLittle',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#aa517940b85a79b02da3f4912465ed406',1,'cv::ocl::Device']]], + ['endl_174',['endl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8b3758bb8f17c440c7963363f42f69f3',1,'std']]], + ['endpointx_175',['endPointX',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a43b634f8f6b5953f2491b00bf6c231f6',1,'cv::line_descriptor::KeyLine']]], + ['endpointy_176',['endPointY',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a1b528bf3d1f3ab902e279ba1b5a593f1',1,'cv::line_descriptor::KeyLine']]], + ['ends_177',['ends',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae870682737bc550409474930f055508b',1,'std']]], + ['endwritechunk_178',['endWriteChunk',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a4a774a8526f6cd0a6ba115c6542c9acb',1,'cv::AVIWriteContainer']]], + ['endwritestruct_179',['endWriteStruct',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ab57944e5c8dacfa7866c70c4ceaaab7b',1,'cv::FileStorage']]], + ['energy_180',['energy',['https://docs.opencv.org/4.2.0/dc/db4/structcv_1_1ml_1_1SimulatedAnnealingSolverSystem.html#a8a83580af0db9f06247bb99862eb64d9',1,'cv::ml::SimulatedAnnealingSolverSystem']]], + ['enforcelabelconnectivity_181',['enforceLabelConnectivity',['https://docs.opencv.org/4.2.0/d5/da0/classcv_1_1ximgproc_1_1SuperpixelLSC.html#a581c406e453505b727dc38739d00d0b2',1,'cv::ximgproc::SuperpixelLSC::enforceLabelConnectivity()'],['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1ximgproc_1_1SuperpixelSLIC.html#ad510b470e0dfde77450ff7c85ed0714c',1,'cv::ximgproc::SuperpixelSLIC::enforceLabelConnectivity()']]], + ['enqueuehostcallback_182',['enqueueHostCallback',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#aaad28e33e26b9c19c8d0c87c1d6f733d',1,'cv::cuda::Stream']]], + ['ensureinclusionconstraint_183',['ensureInclusionConstraint',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga8e28e77e2b7582f3c022e9772117d045',1,'cv::videostab::ensureInclusionConstraint()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga8e28e77e2b7582f3c022e9772117d045',1,'ensureInclusionConstraint()(Global Namespace)']]], + ['ensuresizeisenough_184',['ensureSizeIsEnough',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga4551c222cdf97ebdb4d7440fecfc737a',1,'cv::cuda::ensureSizeIsEnough()'],['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html#ga4551c222cdf97ebdb4d7440fecfc737a',1,'ensureSizeIsEnough()(Global Namespace)']]], + ['ensurewithinwheelspeedlimit_185',['ensureWithinWheelSpeedLimit',['../classkinematics_1_1DiffDriveKinematics.html#adf53055ac0c957c0f4fc7d3954ec3eec',1,'kinematics::DiffDriveKinematics']]], + ['entity_5faabb_5fworld_186',['ENTITY_AABB_WORLD',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8a9b8d138748e3114bc1ebae65837efdfd',1,'cv::ovis::ENTITY_AABB_WORLD'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8a9b8d138748e3114bc1ebae65837efdfd',1,'ENTITY_AABB_WORLD(Global Namespace)']]], + ['entity_5fanimblend_5fmode_187',['ENTITY_ANIMBLEND_MODE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8a4fe0b9f283b57608e744032e28e8d5d8',1,'cv::ovis::ENTITY_ANIMBLEND_MODE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8a4fe0b9f283b57608e744032e28e8d5d8',1,'ENTITY_ANIMBLEND_MODE(Global Namespace)']]], + ['entity_5fmaterial_188',['ENTITY_MATERIAL',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8a255cf920ff3705482c8a2d84630f0d81',1,'cv::ovis::ENTITY_MATERIAL'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8a255cf920ff3705482c8a2d84630f0d81',1,'ENTITY_MATERIAL(Global Namespace)']]], + ['entity_5fscale_189',['ENTITY_SCALE',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8ac44a6bd329c63f7560db179852fa9476',1,'cv::ovis::ENTITY_SCALE'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#gga2bc1852949fc37d8ae7acf53ba3b19a8ac44a6bd329c63f7560db179852fa9476',1,'ENTITY_SCALE(Global Namespace)']]], + ['entityproperty_190',['EntityProperty',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga2bc1852949fc37d8ae7acf53ba3b19a8',1,'cv::ovis::EntityProperty'],['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html#ga2bc1852949fc37d8ae7acf53ba3b19a8',1,'EntityProperty(Global Namespace)']]], + ['entry_5fcmp_191',['entry_cmp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11575.html',1,'__gnu_pbds::detail']]], + ['entry_5fcmp_2ehpp_192',['entry_cmp.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01175.html',1,'']]], + ['entry_5fcmp_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20false_20_3e_193',['entry_cmp< _VTp, Cmp_Fn, _Alloc, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11583.html',1,'__gnu_pbds::detail']]], + ['entry_5fcmp_3c_20_5fvtp_2c_20cmp_5ffn_2c_20_5falloc_2c_20true_20_3e_194',['entry_cmp< _VTp, Cmp_Fn, _Alloc, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11579.html',1,'__gnu_pbds::detail']]], + ['entry_5flist_5ffn_5fimps_2ehpp_195',['entry_list_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01265.html',1,'']]], + ['entry_5fmetadata_5fbase_2ehpp_196',['entry_metadata_base.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01355.html',1,'']]], + ['entry_5fpred_197',['entry_pred',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11591.html',1,'__gnu_pbds::detail']]], + ['entry_5fpred_2ehpp_198',['entry_pred.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01178.html',1,'']]], + ['entry_5fpred_3c_20_5fvtp_2c_20pred_2c_20_5falloc_2c_20false_20_3e_199',['entry_pred< _VTp, Pred, _Alloc, false >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11599.html',1,'__gnu_pbds::detail']]], + ['entry_5fpred_3c_20_5fvtp_2c_20pred_2c_20_5falloc_2c_20true_20_3e_200',['entry_pred< _VTp, Pred, _Alloc, true >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11595.html',1,'__gnu_pbds::detail']]], + ['enumerations_201',['Enumerations',['https://eigen.tuxfamily.org/dox/group__enums.html',1,'']]], + ['eof_202',['eof',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'basic_ios< char, _Traits >::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'basic_iostream< char >::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'basic_istream< char >::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'basic_istream< char, _Traits >::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'basic_ostream< char >::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'basic_ostream< char, _Traits >::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_fstream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_ifstream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_ios::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_iostream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_istream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_istringstream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_ofstream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_ostream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_ostringstream::eof()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a0a9f086f16995b35aad9db9d3adf843f',1,'std::basic_stringstream::eof()']]], + ['eofbit_203',['eofbit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_ios< char, _Traits >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_iostream< char >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_istream< char >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_istream< char, _Traits >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_ostream< char >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_ostream< char, _Traits >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_fstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ifstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ios::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_iostream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_istream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_istringstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ofstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ostream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ostringstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_stringstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::ios_base::eofbit']]], + ['epipolar_20geometry_204',['Epipolar Geometry',['https://docs.opencv.org/4.2.0/da/de9/tutorial_py_epipolar_geometry.html',1,'']]], + ['epointinoctavex_205',['ePointInOctaveX',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a260a577f6dc5778ef2fc668c5df32eb7',1,'cv::line_descriptor::KeyLine']]], + ['epointinoctavey_206',['ePointInOctaveY',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a1f16ffeca01cfc6bfd9cec4c925c4248',1,'cv::line_descriptor::KeyLine']]], + ['epptr_207',['epptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'__gnu_cxx::enc_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'__gnu_cxx::enc_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'__gnu_cxx::stdio_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'__gnu_cxx::stdio_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'__gnu_cxx::stdio_sync_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'__gnu_cxx::stdio_sync_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_filebuf< char_type, traits_type >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_filebuf< char_type, traits_type >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_streambuf< _Elem, _Tr >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_streambuf< _Elem, _Tr >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_streambuf< char, _Traits >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_streambuf< char, _Traits >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_streambuf< char, char_traits< char > >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'basic_streambuf< char, char_traits< char > >::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::basic_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::basic_filebuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::basic_streambuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::basic_streambuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::basic_stringbuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::basic_stringbuf::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::wbuffer_convert::epptr() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6b3f675c4d60188e1291eca9fc755458',1,'std::wbuffer_convert::epptr() const']]], + ['eps_208',['EPS',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57a857609e73e7028e638d2ea649f3b45d5',1,'cv::TermCriteria']]], + ['eps_209',['eps',['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html#a3b26a5ba0c8fc5f764a754dd8eb2189c',1,'cv::dnn::MVNLayer::eps'],['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#a12a0a87af93c54e5b9dd67aea517d2dd',1,'cv::videostab::RansacParams::eps'],['https://docs.opencv.org/4.2.0/d1/d65/classcv_1_1SimilarRects.html#a033c52ed5aa5b2473c169b9c7056ab05',1,'cv::SimilarRects::eps'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga94978663ce70a161bf9c6fa1a35143b0',1,'cv::softdouble::eps()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga7d52b83bca0ec1b316337800ac2986d1',1,'cv::softfloat::eps()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga7d52b83bca0ec1b316337800ac2986d1',1,'eps()(Global Namespace)']]], + ['eps_5fsvr_210',['EPS_SVR',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fac6fd17721f6a7b5c10f3ae48b78ed944',1,'cv::ml::SVM']]], + ['epsilon_211',['epsilon',['https://docs.opencv.org/4.2.0/d4/dd2/classcv_1_1dnn_1_1BatchNormLayer.html#a6c1e22d35ea56e83747ab94d5890f54d',1,'cv::dnn::BatchNormLayer::epsilon'],['https://docs.opencv.org/4.2.0/dc/df8/classcv_1_1dnn_1_1NormalizeBBoxLayer.html#ac1c3a38875be28fbcfe190319bd54cfa',1,'cv::dnn::NormalizeBBoxLayer::epsilon'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#ad25836c3b6f8feea30dfdcab528e23d1',1,'cv::TermCriteria::epsilon'],['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html#a7638f789207589df873b1121d365ab87',1,'cv::cudev::numeric_limits< double >::epsilon()'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html#a0b4daf70cf2f744a86d1de141c87f26c',1,'cv::cudev::numeric_limits< float >::epsilon()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#a36c481134680c7d422edde6d75346b96',1,'std::numeric_limits::epsilon()'],['../namespaceutil.html#af941384c3c1746bf015a31daf66829ec',1,'util::epsilon']]], + ['eq_5fby_5fless_212',['eq_by_less',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11695.html',1,'__gnu_pbds::detail']]], + ['eq_5fby_5fless_2ehpp_213',['eq_by_less.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01295.html',1,'']]], + ['equal_214',['equal',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#aaf5799b2a894bef2fa6763f7017b88b2',1,'std::istreambuf_iterator::equal()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga444f163947d0a55953d1c317b31aee89',1,'std::equal(_IIter1 __first1, _IIter1 __last1, _IIter2 __first2, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad9f16258cd8b86bb63165c004cf660d5',1,'std::equal(_II1 __first1, _II1 __last1, _II2 __first2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga89c2fd41282045655b0edaa54773d4db',1,'std::equal(_II1 __first1, _II1 __last1, _II2 __first2, _II2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga8e56a22bed21e9134369f4b2a47ba407',1,'std::equal(_IIter1 __first1, _IIter1 __last1, _IIter2 __first2, _IIter2 __last2, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga444f163947d0a55953d1c317b31aee89',1,'equal(_IIter1 __first1, _IIter1 __last1, _IIter2 __first2, _BinaryPredicate __binary_pred)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad9f16258cd8b86bb63165c004cf660d5',1,'equal(_II1 __first1, _II1 __last1, _II2 __first2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga89c2fd41282045655b0edaa54773d4db',1,'equal(_II1 __first1, _II1 __last1, _II2 __first2, _II2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga8e56a22bed21e9134369f4b2a47ba407',1,'equal(_IIter1 __first1, _IIter1 __last1, _IIter2 __first2, _IIter2 __last2, _BinaryPredicate __binary_pred)(Global Namespace)']]], + ['equal_5frange_215',['equal_range',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a5e0d4434a099805754b757634f18cc23',1,'std::map::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ae814e0a8ac259c3119c95716748f7819',1,'std::map::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ad849929336a71e065e43fdf6a294140e',1,'std::map::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a14e9a1f958274d603fe083a7b9f50558',1,'std::map::equal_range(const _Kt &__x) const -> decltype(pair< const_iterator, const_iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a5e0d4434a099805754b757634f18cc23',1,'std::map::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ae814e0a8ac259c3119c95716748f7819',1,'std::map::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ad849929336a71e065e43fdf6a294140e',1,'std::map::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a14e9a1f958274d603fe083a7b9f50558',1,'std::map::equal_range(const _Kt &__x) const -> decltype(pair< const_iterator, const_iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a809cb1bf6cdd0a8c13e55515ec5a8e7c',1,'std::multimap::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ac801d3c3f152e5d98036307e9de7e538',1,'std::multimap::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a6bb7a029cda04dcfcc905c4c80516bd9',1,'std::multimap::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2e558be043081e52a931317369759384',1,'std::multimap::equal_range(const _Kt &__x) const -> decltype(pair< const_iterator, const_iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a809cb1bf6cdd0a8c13e55515ec5a8e7c',1,'std::multimap::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ac801d3c3f152e5d98036307e9de7e538',1,'std::multimap::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a6bb7a029cda04dcfcc905c4c80516bd9',1,'std::multimap::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2e558be043081e52a931317369759384',1,'std::multimap::equal_range(const _Kt &__x) const -> decltype(pair< const_iterator, const_iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#af02e09bba88000ac8487f66c9d5f0bdb',1,'std::multiset::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aabff907f910392ba764de55f420727cf',1,'std::multiset::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#add69a9f99e1c6f68636c6c0c9cf57ef6',1,'std::multiset::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ab6135bf8d9a5d292c335e2ca40cdf083',1,'std::multiset::equal_range(const _Kt &__x) const -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#af02e09bba88000ac8487f66c9d5f0bdb',1,'std::multiset::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aabff907f910392ba764de55f420727cf',1,'std::multiset::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#add69a9f99e1c6f68636c6c0c9cf57ef6',1,'std::multiset::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ab6135bf8d9a5d292c335e2ca40cdf083',1,'std::multiset::equal_range(const _Kt &__x) const -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af9f201350c153d3da65fe02191c0129f',1,'std::set::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ae0872a3e56b0583c37aab5d20514b479',1,'std::set::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aad7aaff6e514ff8b528c0d6138342198',1,'std::set::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aae9750edc8da201383f8894b70bbda0b',1,'std::set::equal_range(const _Kt &__x) const -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af9f201350c153d3da65fe02191c0129f',1,'std::set::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ae0872a3e56b0583c37aab5d20514b479',1,'std::set::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aad7aaff6e514ff8b528c0d6138342198',1,'std::set::equal_range(const _Kt &__x) -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aae9750edc8da201383f8894b70bbda0b',1,'std::set::equal_range(const _Kt &__x) const -> decltype(pair< iterator, iterator >(_M_t._M_equal_range_tr(__x)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a301e117827c134ed289b5d19e5c8a36e',1,'std::unordered_map::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21e644ce722b02f5304757ea9be5b23e',1,'std::unordered_map::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a301e117827c134ed289b5d19e5c8a36e',1,'std::unordered_map::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21e644ce722b02f5304757ea9be5b23e',1,'std::unordered_map::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a55b2bb934fcc4f41eaa67280c73ff1d5',1,'std::unordered_multimap::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a6c608c4a4f2041d5045df49143124cfa',1,'std::unordered_multimap::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a55b2bb934fcc4f41eaa67280c73ff1d5',1,'std::unordered_multimap::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a6c608c4a4f2041d5045df49143124cfa',1,'std::unordered_multimap::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a14673553f519f4299e97892aaff3becf',1,'std::unordered_multiset::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a5c639624ebbe3e667dafad278f21ce05',1,'std::unordered_multiset::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a14673553f519f4299e97892aaff3becf',1,'std::unordered_multiset::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a5c639624ebbe3e667dafad278f21ce05',1,'std::unordered_multiset::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae91bd4ef581ac83337d7cced559349e2',1,'std::unordered_set::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae5f593da6d71d91fb83d2e6023ad8d87',1,'std::unordered_set::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae91bd4ef581ac83337d7cced559349e2',1,'std::unordered_set::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae5f593da6d71d91fb83d2e6023ad8d87',1,'std::unordered_set::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a301e117827c134ed289b5d19e5c8a36e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21e644ce722b02f5304757ea9be5b23e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a301e117827c134ed289b5d19e5c8a36e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::equal_range(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21e644ce722b02f5304757ea9be5b23e',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::equal_range(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga67b70af6f618f2c566d2f1849735fb6e',1,'std::equal_range(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga2d3802f907c482a269e17ec3714d3df0',1,'std::equal_range(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga67b70af6f618f2c566d2f1849735fb6e',1,'equal_range(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01493.html#ga2d3802f907c482a269e17ec3714d3df0',1,'equal_range(_ForwardIterator __first, _ForwardIterator __last, const _Tp &__val, _Compare __comp)(Global Namespace)']]], + ['equal_5fsplit_5ftag_216',['equal_split_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09771.html',1,'__gnu_parallel']]], + ['equal_5fto_217',['equal_to',['https://docs.opencv.org/4.2.0/d2/dfd/structcv_1_1cudev_1_1equal__to.html',1,'cv::cudev::equal_to< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07403.html',1,'std::equal_to< _Tp >']]], + ['equal_5fto_3c_20void_20_3e_218',['equal_to< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07443.html',1,'std']]], + ['equalization_219',['Equalization',['https://docs.opencv.org/4.2.0/d4/d1b/tutorial_histogram_equalization.html',1,'Histogram Equalization'],['https://docs.opencv.org/4.2.0/d5/daf/tutorial_py_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization'],['https://docs.opencv.org/4.2.0/d2/d74/tutorial_js_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization']]], + ['equalizehist_220',['equalizeHist',['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga7e54091f0c937d49bf84152a16f76d6e',1,'cv::equalizeHist()'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga2384be74bd2feba7e6c46815513f0060',1,'cv::cuda::equalizeHist()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaa7c977c041670443eda46750f3bfaf02',1,'cv::gapi::equalizeHist()'],['https://docs.opencv.org/4.2.0/d6/dc7/group__imgproc__hist.html#ga7e54091f0c937d49bf84152a16f76d6e',1,'equalizeHist(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaa7c977c041670443eda46750f3bfaf02',1,'equalizeHist(const GMat &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga2384be74bd2feba7e6c46815513f0060',1,'equalizeHist(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], + ['equally_5fsplit_2eh_221',['equally_split.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00890.html',1,'']]], + ['equals_222',['equals',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html#a44c6fd7ac40c7338196f1aa8db50e0b4',1,'std::tr2::bool_set']]], + ['equalto_223',['equalTo',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a693c0472549f95a40cb7ea13a602db53',1,'cv::FileNodeIterator']]], + ['erase_224',['erase',['https://docs.opencv.org/4.2.0/d9/d2b/classcv_1_1dnn_1_1Dict.html#a4017726cf4cb43a34037ef40c2e60204',1,'cv::dnn::Dict::erase()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ad4ff041a2a3771613847b94c761ab1f4',1,'cv::SparseMat::erase(int i0, int i1, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ab00d2c0c7bff3c631d1ac43fe1be45cd',1,'cv::SparseMat::erase(int i0, int i1, int i2, size_t *hashval=0)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a6f64485a3f47ba79847a3fdf349b9943',1,'cv::SparseMat::erase(const int *idx, size_t *hashval=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ad63b0c68fd53a88dd84b88151da790e3',1,'__gnu_cxx::__versa_string::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a76c619cf8a8209bc94c50da98772326f',1,'__gnu_cxx::__versa_string::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a936fb32c88d2acb1e3d318cbb53c91a2',1,'__gnu_cxx::__versa_string::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'__gnu_debug::basic_string::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'__gnu_debug::basic_string::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< _CharT >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< _CharT >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< _CharT >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< _CharT, _Traits, _Allocator >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< _CharT, _Traits, _Allocator >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< _CharT, _Traits, _Allocator >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< char >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< char >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< char >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< char, char_traits< char >, _Byte_alloc >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< char, char_traits< char >, _Byte_alloc >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< char, char_traits< char >, _Byte_alloc >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< char_type, _Traits, _Alloc >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< char_type, _Traits, _Alloc >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< char_type, _Traits, _Alloc >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'basic_string< value_type >::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'basic_string< value_type >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'basic_string< value_type >::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0e0812f0cacd5dfd1108455df4fda375',1,'deque< _StateSeqT >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#af8f15e04574604071004bcdcd3be22fc',1,'deque< _StateSeqT >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aee5d29fe9b6e9494a71022ca980502be',1,'list< __inp, __rebind_inp >::erase(const_iterator __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a927ad4d7e4673d4b2b33a16de379671b',1,'list< __inp, __rebind_inp >::erase(const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'match_results< _Bi_iter >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'match_results< _Bi_iter >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad0c376cb963e61712842490d44d53a74',1,'std::basic_string::erase(size_type __pos=0, size_type __n=npos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a28aff931bdb19be2c6b1658d6bb03f71',1,'std::basic_string::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a14043b49e3ab3c8834b1936a8bdf7fd7',1,'std::basic_string::erase(iterator __first, iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a0e0812f0cacd5dfd1108455df4fda375',1,'std::deque::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#af8f15e04574604071004bcdcd3be22fc',1,'std::deque::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aee5d29fe9b6e9494a71022ca980502be',1,'std::list::erase(const_iterator __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a927ad4d7e4673d4b2b33a16de379671b',1,'std::list::erase(const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a6b510fc380b070d899d73a278cbb8faf',1,'std::map::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#aa98a4bd34df51b51262b26f06a657efe',1,'std::map::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ac9ea51e48199ff9a87ea1b855789e53d',1,'std::map::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ae60f51e27db51a169ee4e368d238f69e',1,'std::map::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ac9ea51e48199ff9a87ea1b855789e53d',1,'std::map::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ae60f51e27db51a169ee4e368d238f69e',1,'std::map::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'std::match_results::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'std::match_results::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a158f583b90ec4083b4f50a5e46acfee2',1,'std::multimap::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a5f6fbe45cea6915a1276877d56acc0fd',1,'std::multimap::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a4543f2d47f11611811b27b58c73d2c24',1,'std::multimap::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a9cd3e5f506653300983a32fe9df9fcd5',1,'std::multimap::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a4543f2d47f11611811b27b58c73d2c24',1,'std::multimap::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a9cd3e5f506653300983a32fe9df9fcd5',1,'std::multimap::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aa51df64436f0118f064c49d49c8138f4',1,'std::multiset::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ab9fe5fb5a5638e620268e30e640b104c',1,'std::multiset::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a2fcf6dd3ed37a1bac19ba5e55239d77e',1,'std::multiset::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2122b626db1a6a97c0bec69f4e766591',1,'std::set::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af75595c05a003b09225a0367cbe4d468',1,'std::set::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#aa73f253934bbb48e214bb21b89812cbb',1,'std::set::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a56149c061cd4aca92d631f7ad5a5a737',1,'std::unordered_map::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a1b17775816c782568baefd357cd50e88',1,'std::unordered_map::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adef61b0f6b1e43cfdb648e247277ba00',1,'std::unordered_map::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab04b983f5337e79f121f2df4bbaa283c',1,'std::unordered_map::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adef61b0f6b1e43cfdb648e247277ba00',1,'std::unordered_map::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab04b983f5337e79f121f2df4bbaa283c',1,'std::unordered_map::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a09397dfd53f29fdbc8809d37ab11b142',1,'std::unordered_multimap::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#aa38e97c00a7b10fb37726206ebc57800',1,'std::unordered_multimap::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a671564fa7d5dd0e04b651e78861c89ba',1,'std::unordered_multimap::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a08eec5ee5f497c48d356443110934fdd',1,'std::unordered_multimap::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a671564fa7d5dd0e04b651e78861c89ba',1,'std::unordered_multimap::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a08eec5ee5f497c48d356443110934fdd',1,'std::unordered_multimap::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af75d57a40e15b929ee8931d5894164fc',1,'std::unordered_multiset::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a8d9f85005b81ca530aeeb413a38824ab',1,'std::unordered_multiset::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a7f56a12c1ac7a74ad413f075b58ddf09',1,'std::unordered_multiset::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ab3d07df2db9b602425527841d3e0e876',1,'std::unordered_multiset::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a7f56a12c1ac7a74ad413f075b58ddf09',1,'std::unordered_multiset::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#ab3d07df2db9b602425527841d3e0e876',1,'std::unordered_multiset::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ac935f6a3b65fe0e5629ada1699c86868',1,'std::unordered_set::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#acd7b3eed2fde01c393da9d14f1aa03b9',1,'std::unordered_set::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#acef2fe55c494314acad1104ba1488cf6',1,'std::unordered_set::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a5475af91b7b075f1315091b522eacd3e',1,'std::unordered_set::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#acef2fe55c494314acad1104ba1488cf6',1,'std::unordered_set::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a5475af91b7b075f1315091b522eacd3e',1,'std::unordered_set::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'std::vector::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'std::vector::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a56149c061cd4aca92d631f7ad5a5a737',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::erase(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a1b17775816c782568baefd357cd50e88',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adef61b0f6b1e43cfdb648e247277ba00',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab04b983f5337e79f121f2df4bbaa283c',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#adef61b0f6b1e43cfdb648e247277ba00',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ab04b983f5337e79f121f2df4bbaa283c',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::erase(iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< __diff_type >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< __diff_type >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _CharClassT >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _CharClassT >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _CharT >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _CharT >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _Cmpt >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _Cmpt >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _Node *, _Nodeptr_Alloc >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _Node *, _Nodeptr_Alloc >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _RealType >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _RealType >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _State< _TraitsT::char_type > >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _State< _TraitsT::char_type > >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< _StringT >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< _StringT >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< block_type, allocator_type >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< block_type, allocator_type >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< Catalog_info * >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< Catalog_info * >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< double >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< double >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< int >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< int >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< result_type >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< result_type >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< size_t >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< size_t >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< std::pair< _BiIter, int > >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< std::pair< _BiIter, int > >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< std::pair< _StateIdT, std::vector > >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< std::pair< _StateIdT, std::vector > >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< std::pair< _StrTransT, _StrTransT > >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< std::pair< _StrTransT, _StrTransT > >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< sub_match< _Bi_iter >, _Alloc >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< sub_match< _Bi_iter >, _Alloc >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::erase(const_iterator __first, const_iterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1c8b8734443a1028d00ad364190bac76',1,'vector< sub_match< _BiIter >, _Alloc >::erase(const_iterator __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aae89e304cceda4179427223add91eebb',1,'vector< sub_match< _BiIter >, _Alloc >::erase(const_iterator __first, const_iterator __last)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a494632b69bbe1d0153d3bedad0901b8e.html#a494632b69bbe1d0153d3bedad0901b8e',1,'nlohmann::basic_json::erase(IteratorType pos)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a8ac83750e267e37d5d47591eb44cce42.html#a8ac83750e267e37d5d47591eb44cce42',1,'nlohmann::basic_json::erase(IteratorType first, IteratorType last)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_af72b1c9d1502b02a49a0cb9db9f980ea.html#af72b1c9d1502b02a49a0cb9db9f980ea',1,'nlohmann::basic_json::erase(const typename object_t::key_type &key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a221b943d3228488c14225e55f726cc26.html#a221b943d3228488c14225e55f726cc26',1,'nlohmann::basic_json::erase(const size_type idx)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a583c8976bbf0c137ff8e2439878f3058.html#a583c8976bbf0c137ff8e2439878f3058',1,'nlohmann::ordered_map::erase(const Key &key)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a26053569acb0a858d87482b2fa3d5dc5.html#a26053569acb0a858d87482b2fa3d5dc5',1,'nlohmann::ordered_map::erase(iterator pos)']]], + ['erase_5fafter_225',['erase_after',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a369164fbcb598a49bbd7297eb6f2c5b0',1,'std::forward_list::erase_after(const_iterator __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aa779e251eac11a2d84fa9a2b65921bae',1,'std::forward_list::erase_after(const_iterator __pos, const_iterator __last)']]], + ['erase_5fcan_5fthrow_226',['erase_can_throw',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html#ace925c8be06b3640abb7b6f486290daba04adc70b657d67c81caf60c8722c9ada',1,'__gnu_pbds::container_traits']]], + ['erase_5fif_2eh_227',['erase_if.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00326.html',1,'']]], + ['erf_228',['erf',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ac336e0eba2b12dca8b01da1a006566c3',1,'Eigen']]], + ['erfc_229',['erfc',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a17bcfbd19ed883ecf581f06ac1eeeb8c',1,'Eigen']]], + ['erfilter_230',['ERFilter',['https://docs.opencv.org/4.2.0/da/def/classcv_1_1text_1_1ERFilter.html',1,'cv::text']]], + ['erfilter_2ehpp_231',['erfilter.hpp',['https://docs.opencv.org/4.2.0/df/d05/erfilter_8hpp.html',1,'']]], + ['erfilter_5fnm_5fihsgrad_232',['ERFILTER_NM_IHSGrad',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggadf9a9875b63a06536a6071af56e54971a00b4e765bdc40567ad70beb7df464e06',1,'cv::text::ERFILTER_NM_IHSGrad'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggadf9a9875b63a06536a6071af56e54971a00b4e765bdc40567ad70beb7df464e06',1,'ERFILTER_NM_IHSGrad(Global Namespace)']]], + ['erfilter_5fnm_5frgblgrad_233',['ERFILTER_NM_RGBLGrad',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggadf9a9875b63a06536a6071af56e54971a79e06bd9ad5b17411581ac430f805e66',1,'cv::text::ERFILTER_NM_RGBLGrad'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggadf9a9875b63a06536a6071af56e54971a79e06bd9ad5b17411581ac430f805e66',1,'ERFILTER_NM_RGBLGrad(Global Namespace)']]], + ['ergrouping_234',['erGrouping',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga6299380bbb9141488220bdee62b62cd1',1,'cv::text::erGrouping(InputArray img, InputArrayOfArrays channels, std::vector< std::vector< ERStat > > &regions, std::vector< std::vector< Vec2i > > &groups, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const std::string &filename=std::string(), float minProbablity=0.5)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga807dea4f63f6e2b59c9ac22d35e23926',1,'cv::text::erGrouping(InputArray image, InputArray channel, std::vector< std::vector< Point > > regions, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const String &filename=String(), float minProbablity=(float) 0.5)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga6299380bbb9141488220bdee62b62cd1',1,'erGrouping(InputArray img, InputArrayOfArrays channels, std::vector< std::vector< ERStat > > &regions, std::vector< std::vector< Vec2i > > &groups, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const std::string &filename=std::string(), float minProbablity=0.5)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ga807dea4f63f6e2b59c9ac22d35e23926',1,'erGrouping(InputArray image, InputArray channel, std::vector< std::vector< Point > > regions, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const String &filename=String(), float minProbablity=(float) 0.5)(Global Namespace)']]], + ['ergrouping_5fmodes_235',['erGrouping_Modes',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gac71e4c8addcf8f6dabc9b6da401d5eb9',1,'cv::text::erGrouping_Modes'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gac71e4c8addcf8f6dabc9b6da401d5eb9',1,'erGrouping_Modes(Global Namespace)']]], + ['ergrouping_5forientation_5fany_236',['ERGROUPING_ORIENTATION_ANY',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggac71e4c8addcf8f6dabc9b6da401d5eb9aa88b048d788f8f61bcec6c478078e3c4',1,'cv::text::ERGROUPING_ORIENTATION_ANY'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggac71e4c8addcf8f6dabc9b6da401d5eb9aa88b048d788f8f61bcec6c478078e3c4',1,'ERGROUPING_ORIENTATION_ANY(Global Namespace)']]], + ['ergrouping_5forientation_5fhoriz_237',['ERGROUPING_ORIENTATION_HORIZ',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggac71e4c8addcf8f6dabc9b6da401d5eb9a27297f8181275dff67535f204e4bdd62',1,'cv::text::ERGROUPING_ORIENTATION_HORIZ'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#ggac71e4c8addcf8f6dabc9b6da401d5eb9a27297f8181275dff67535f204e4bdd62',1,'ERGROUPING_ORIENTATION_HORIZ(Global Namespace)']]], + ['erode_238',['erode',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaeb1e0c1033e3f6b891a25d0511362aeb',1,'cv::erode()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga8d275850ccc5009372dd21237dcf1836',1,'cv::gapi::erode()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga1903619622035efbe28ad08151f60ec3',1,'cv::ximgproc::rl::erode()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaeb1e0c1033e3f6b891a25d0511362aeb',1,'erode(InputArray src, OutputArray dst, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga8d275850ccc5009372dd21237dcf1836',1,'erode(const GMat &src, const Mat &kernel, const Point &anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga1903619622035efbe28ad08151f60ec3',1,'erode(InputArray rlSrc, OutputArray rlDest, InputArray rlKernel, bool bBoundaryOn=true, Point anchor=Point(0, 0))(Global Namespace)']]], + ['erode3x3_239',['erode3x3',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga48591777d1073198ece7b0f1c2bd885c',1,'cv::gapi::erode3x3()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga48591777d1073198ece7b0f1c2bd885c',1,'erode3x3(const GMat &src, int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)']]], + ['eroding_20and_20dilating_240',['Eroding and Dilating',['https://docs.opencv.org/4.2.0/db/df6/tutorial_erosion_dilatation.html',1,'']]], + ['erosion_5fdilatation_2emarkdown_241',['erosion_dilatation.markdown',['https://docs.opencv.org/4.2.0/d6/d6c/erosion__dilatation_8markdown.html',1,'']]], + ['err_242',['err',['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a9d60908aaaad08b135bc3d8cea4dd676',1,'cv::Exception::err'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a37cf77db73ddf2eaace21028c99b0cf7',1,'cv::LineIterator::err']]], + ['err_5fcamera_5fparams_5fadjust_5ffail_243',['ERR_CAMERA_PARAMS_ADJUST_FAIL',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a507409ce9435dd89857469d12ec06b45aabbdc1cc372c5aacc5266c5e2df0d492',1,'cv::Stitcher']]], + ['err_5fhomography_5fest_5ffail_244',['ERR_HOMOGRAPHY_EST_FAIL',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a507409ce9435dd89857469d12ec06b45af0b270c03b2a88cd0415c8e3f5e58c3e',1,'cv::Stitcher']]], + ['err_5fneed_5fmore_5fimgs_245',['ERR_NEED_MORE_IMGS',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a507409ce9435dd89857469d12ec06b45a2d8d41bde739520bdc0a75af8c869bbe',1,'cv::Stitcher']]], + ['error_246',['error',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a117c241af3fb1141ad0916a3cf3157ec',1,'Eigen::IterativeSolverBase::error()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga4910d7f86336cd4eff9dd05575667e41',1,'cv::error(const Exception &exc)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gacbd081fdb20423a63cf731569ba70b2b',1,'cv::error(int _code, const String &_err, const char *_func, const char *_file, int _line)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga4910d7f86336cd4eff9dd05575667e41',1,'error(const Exception &exc)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gacbd081fdb20423a63cf731569ba70b2b',1,'error(int _code, const String &_err, const char *_func, const char *_file, int _line)(Global Namespace)']]], + ['error_5fbackref_247',['error_backref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#acc0f88e638558f5c3bb64ea44832493b',1,'std::regex_constants']]], + ['error_5fbadbrace_248',['error_badbrace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a272600147c8274c0d78fcda6b53eb0c6',1,'std::regex_constants']]], + ['error_5fbadrepeat_249',['error_badrepeat',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a47399faadc6f427a172a84d78945394c',1,'std::regex_constants']]], + ['error_5fbrace_250',['error_brace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a23b6569c17f71c8b1c00b515b8e02a0d',1,'std::regex_constants']]], + ['error_5fbrack_251',['error_brack',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ac9ef78846632df7d0916b933191e3bcc',1,'std::regex_constants']]], + ['error_5fcategory_252',['error_category',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02839.html',1,'std::_V2']]], + ['error_5fcode_253',['error_code',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02847.html',1,'std']]], + ['error_5fcollate_254',['error_collate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ade164916507884ce776bba031f7bce60',1,'std::regex_constants']]], + ['error_5fcomplexity_255',['error_complexity',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#acdf6decf6d03ea2275dcec3961719d9a',1,'std::regex_constants']]], + ['error_5fcondition_256',['error_condition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02851.html',1,'std']]], + ['error_5fconstants_2eh_257',['error_constants.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00689.html',1,'']]], + ['error_5fctype_258',['error_ctype',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a19db2783be8034b2dd52e99657184670',1,'std::regex_constants']]], + ['error_5fescape_259',['error_escape',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a27917cafce40928457c789313f8e7ba6',1,'std::regex_constants']]], + ['error_5fhandler_5ft_260',['error_handler_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a1e7ca76cc3f62626b380be5e18a002d5.html#a1e7ca76cc3f62626b380be5e18a002d5',1,'nlohmann::basic_json']]], + ['error_5fparen_261',['error_paren',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a828988901e2b5aafb2ad06adde9e581b',1,'std::regex_constants']]], + ['error_5frange_262',['error_range',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a38aa5041411e6e3d98057811eb691cd0',1,'std::regex_constants']]], + ['error_5fspace_263',['error_space',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a1200d5e70723aa0ae0153c74fd3d02e0',1,'std::regex_constants']]], + ['error_5fstack_264',['error_stack',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ac625782ad8167c9f36b1e32b65df2159',1,'std::regex_constants']]], + ['error_5ftype_265',['error_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#afe4178e24e6fad9f043d52b9de32e488',1,'std::regex_constants']]], + ['errorcallback_266',['ErrorCallback',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae52d6d11c71181d60f0a30eed078d66d',1,'cv::ErrorCallback'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gae52d6d11c71181d60f0a30eed078d66d',1,'ErrorCallback(Global Namespace)']]], + ['errorcorrectionrate_267',['errorCorrectionRate',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#aae04d6771833012d13220ba2e85a0b60',1,'cv::aruco::DetectorParameters']]], + ['errorcorrectionsupport_268',['errorCorrectionSupport',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ac1b160e5f02fb4903436e1c4bc3fbb9d',1,'cv::ocl::Device']]], + ['errorcovinit_269',['errorCovInit',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a2b362189084591dae0a9a6f570ed82da',1,'cv::tracking::UnscentedKalmanFilterParams']]], + ['errorcovpost_270',['errorCovPost',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a446d8e9a0105b0aa35cd66119c529803',1,'cv::KalmanFilter']]], + ['errorcovpre_271',['errorCovPre',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#ae1bd3a86f10753d723e7174d570d9ac1',1,'cv::KalmanFilter']]], + ['errortypes_272',['ErrorTypes',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gae5b308134f67997a42e5ca48c2713bcb',1,'cv::ml::ErrorTypes'],['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html#gae5b308134f67997a42e5ca48c2713bcb',1,'ErrorTypes(Global Namespace)']]], + ['erstat_273',['ERStat',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html',1,'cv::text::ERStat'],['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a34d3b4942b555621de67378df8201648',1,'cv::text::ERStat::ERStat()']]], + ['essentialfromfundamental_274',['essentialFromFundamental',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gab948a699b18e85ed516d6e8e0b32c9e3',1,'cv::sfm::essentialFromFundamental()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gab948a699b18e85ed516d6e8e0b32c9e3',1,'essentialFromFundamental()(Global Namespace)']]], + ['essentialfromrt_275',['essentialFromRt',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga732858c7d49c6a44a4a91451b3374350',1,'cv::sfm::essentialFromRt()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga732858c7d49c6a44a4a91451b3374350',1,'essentialFromRt()(Global Namespace)']]], + ['essentialvector_276',['essentialVector',['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ac91cf37b0cbea9e504c89e021fd289ba',1,'Eigen::HouseholderSequence']]], + ['estimate_277',['estimate',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#ac762326fd8ef33c1ce0e065ee783bc3c',1,'cv::detail::BundleAdjusterBase::estimate()'],['https://docs.opencv.org/4.2.0/df/d15/classcv_1_1detail_1_1Estimator.html#ab65ae24f4d6b53554dcc04121e6cbc47',1,'cv::detail::Estimator::estimate()'],['https://docs.opencv.org/4.2.0/d9/db3/classcv_1_1videostab_1_1FromFileMotionReader.html#a7a8a8ce829aa88a3ab8e54ed3f5f66d3',1,'cv::videostab::FromFileMotionReader::estimate()'],['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html#ad00c9820ae28ce5a00edcfc5df526ea2',1,'cv::videostab::ImageMotionEstimatorBase::estimate()'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a5fb98833d57373577ba78799b5abe7e6',1,'cv::videostab::KeypointBasedMotionEstimator::estimate(const Mat &frame0, const Mat &frame1, bool *ok=0) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a3852d2f99345896839dd1efab0898a0e',1,'cv::videostab::KeypointBasedMotionEstimator::estimate(InputArray frame0, InputArray frame1, bool *ok=0)'],['https://docs.opencv.org/4.2.0/db/ddd/classcv_1_1dnn_1_1KeypointsModel.html#a40440d09b67faa468d333374af49e8de',1,'cv::dnn::KeypointsModel::estimate()'],['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html#ad2e3669f3ccb019194cdb770acc6412f',1,'cv::videostab::MotionEstimatorBase::estimate()'],['https://docs.opencv.org/4.2.0/d7/d29/classcv_1_1videostab_1_1MotionEstimatorL1.html#a835b18ec5c6a51d8e82206c50172252b',1,'cv::videostab::MotionEstimatorL1::estimate()'],['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#ab53cec01615fedc6bddef9caeb2e3be7',1,'cv::videostab::MotionEstimatorRansacL2::estimate()'],['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html#afe97e4ca5c85a4ea7ef76e9b6e86a286',1,'cv::videostab::ToFileMotionWriter::estimate()'],['https://docs.opencv.org/4.2.0/d2/db9/classcv_1_1TrackerStateEstimator.html#a14eb1b71daf5ec2dba9a51cdff2c230a',1,'cv::TrackerStateEstimator::estimate()']]], + ['estimateaffine2d_278',['estimateAffine2D',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga27865b1d26bac9ce91efaee83e94d4dd',1,'cv::estimateAffine2D()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga27865b1d26bac9ce91efaee83e94d4dd',1,'estimateAffine2D()(Global Namespace)']]], + ['estimateaffine3d_279',['estimateAffine3D',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga396afb6411b30770e56ab69548724715',1,'cv::estimateAffine3D()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga396afb6411b30770e56ab69548724715',1,'estimateAffine3D()(Global Namespace)']]], + ['estimateaffinepartial2d_280',['estimateAffinePartial2D',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad767faff73e9cbd8b9d92b955b50062d',1,'cv::estimateAffinePartial2D()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad767faff73e9cbd8b9d92b955b50062d',1,'estimateAffinePartial2D(InputArray from, InputArray to, OutputArray inliers=noArray(), int method=RANSAC, double ransacReprojThreshold=3, size_t maxIters=2000, double confidence=0.99, size_t refineIters=10)(Global Namespace)']]], + ['estimated_5fcovariance_2ehpp_281',['estimated_covariance.hpp',['https://docs.opencv.org/4.2.0/d1/dff/estimated__covariance_8hpp.html',1,'']]], + ['estimatedgaussdistribution_282',['EstimatedGaussDistribution',['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1EstimatedGaussDistribution.html',1,'cv::EstimatedGaussDistribution'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1EstimatedGaussDistribution.html#a08ad979ec6e7e923c121ef3257ebc1f6',1,'cv::EstimatedGaussDistribution::EstimatedGaussDistribution()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1EstimatedGaussDistribution.html#a402815fa7f320edac9cf07b5eb66273e',1,'cv::EstimatedGaussDistribution::EstimatedGaussDistribution(float P_mean, float R_mean, float P_sigma, float R_sigma)']]], + ['estimatefocal_283',['estimateFocal',['https://docs.opencv.org/4.2.0/d4/dbc/group__stitching__autocalib.html#ga7de597a5c64fc2b9e64e7889936fd370',1,'cv::detail::estimateFocal()'],['https://docs.opencv.org/4.2.0/d4/dbc/group__stitching__autocalib.html#ga7de597a5c64fc2b9e64e7889936fd370',1,'estimateFocal()(Global Namespace)']]], + ['estimateglobalmotionleastsquares_284',['estimateGlobalMotionLeastSquares',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga8fa2f6a88df65ad78241783faffc26a8',1,'cv::videostab::estimateGlobalMotionLeastSquares()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga8fa2f6a88df65ad78241783faffc26a8',1,'estimateGlobalMotionLeastSquares()(Global Namespace)']]], + ['estimateglobalmotionransac_285',['estimateGlobalMotionRansac',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga6260bd61792a7ec94ea974af9d94ead7',1,'cv::videostab::estimateGlobalMotionRansac()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga6260bd61792a7ec94ea974af9d94ead7',1,'estimateGlobalMotionRansac()(Global Namespace)']]], + ['estimateimpl_286',['estimateImpl',['https://docs.opencv.org/4.2.0/d2/db9/classcv_1_1TrackerStateEstimator.html#a314006b0b08b9c55e44428ad19914e01',1,'cv::TrackerStateEstimator::estimateImpl()'],['https://docs.opencv.org/4.2.0/de/df6/classcv_1_1TrackerStateEstimatorAdaBoosting.html#a4acd63175a1a90d81cd337fcecdcbd91',1,'cv::TrackerStateEstimatorAdaBoosting::estimateImpl()'],['https://docs.opencv.org/4.2.0/d9/d20/classcv_1_1TrackerStateEstimatorMILBoosting.html#a5b38ddc64b2ef01c59ac7f66343a6087',1,'cv::TrackerStateEstimatorMILBoosting::estimateImpl()'],['https://docs.opencv.org/4.2.0/d3/db6/classcv_1_1TrackerStateEstimatorSVM.html#a556e041be7d663ddc7a39e8b3045567d',1,'cv::TrackerStateEstimatorSVM::estimateImpl()']]], + ['estimatemotion_287',['estimateMotion',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#a323e46ff64d821fec51375c4334602bf',1,'cv::videostab::OnePassStabilizer::estimateMotion()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ae07ca7a4967e6158cc157fd61c63cf1f',1,'cv::videostab::StabilizerBase::estimateMotion()'],['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a8687b647f3fec34b52d0f77699b9e2fc',1,'cv::videostab::TwoPassStabilizer::estimateMotion()']]], + ['estimatenewcameramatrixforundistortrectify_288',['estimateNewCameraMatrixForUndistortRectify',['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga384940fdf04c03e362e94b6eb9b673c9',1,'cv::fisheye::estimateNewCameraMatrixForUndistortRectify()'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#ga384940fdf04c03e362e94b6eb9b673c9',1,'estimateNewCameraMatrixForUndistortRectify()(Global Namespace)']]], + ['estimateoptimaltrimratio_289',['estimateOptimalTrimRatio',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#gab049af45e7db622406b58686e81fa5e2',1,'cv::videostab::estimateOptimalTrimRatio()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#gab049af45e7db622406b58686e81fa5e2',1,'estimateOptimalTrimRatio()(Global Namespace)']]], + ['estimateposeboard_290',['estimatePoseBoard',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga366993d29fdddd995fba8c2e6ca811ea',1,'cv::aruco::estimatePoseBoard()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga366993d29fdddd995fba8c2e6ca811ea',1,'estimatePoseBoard()(Global Namespace)']]], + ['estimateposecharucoboard_291',['estimatePoseCharucoBoard',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga21b51b9e8c6422a4bac27e48fa0a150b',1,'cv::aruco::estimatePoseCharucoBoard()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga21b51b9e8c6422a4bac27e48fa0a150b',1,'estimatePoseCharucoBoard()(Global Namespace)']]], + ['estimateposesinglemarkers_292',['estimatePoseSingleMarkers',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga84dd2e88f3e8c3255eb78e0f79571bd1',1,'cv::aruco::estimatePoseSingleMarkers()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#ga84dd2e88f3e8c3255eb78e0f79571bd1',1,'estimatePoseSingleMarkers()(Global Namespace)']]], + ['estimaterecommendedparams_293',['estimateRecommendedParams',['https://docs.opencv.org/4.2.0/de/d7a/classcv_1_1cuda_1_1StereoBeliefPropagation.html#ae832759d923616b73102037c15c43b58',1,'cv::cuda::StereoBeliefPropagation::estimateRecommendedParams()'],['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1cuda_1_1StereoConstantSpaceBP.html#ac72baf7587fc27cb68df1039d173bb9e',1,'cv::cuda::StereoConstantSpaceBP::estimateRecommendedParams()']]], + ['estimaterigidtransform_294',['estimateRigidTransform',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga762cbe5efd52cf078950196f3c616d48',1,'cv::estimateRigidTransform()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga762cbe5efd52cf078950196f3c616d48',1,'estimateRigidTransform()(Global Namespace)']]], + ['estimatestabilizationmotion_295',['estimateStabilizationMotion',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#af3cc7a6d53edae0840100cdce5faa60d',1,'cv::videostab::OnePassStabilizer::estimateStabilizationMotion()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a7cd53ec2cebeeefb57ca5616d3de6ca8',1,'cv::videostab::StabilizerBase::estimateStabilizationMotion()'],['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a264e8021418f46c36788fd999ecfdd7b',1,'cv::videostab::TwoPassStabilizer::estimateStabilizationMotion()']]], + ['estimatetransform_296',['estimateTransform',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a4c25557af4d40a79a4d1f23d9548131d',1,'cv::Stitcher']]], + ['estimatetransformation_297',['estimateTransformation',['https://docs.opencv.org/4.2.0/d5/d72/classcv_1_1ximgproc_1_1ContourFitting.html#af9cd9550a5d1103f687367680f4e0918',1,'cv::ximgproc::ContourFitting::estimateTransformation(InputArray src, InputArray dst, OutputArray alphaPhiST, double *dist=0, bool fdContour=false)'],['https://docs.opencv.org/4.2.0/d5/d72/classcv_1_1ximgproc_1_1ContourFitting.html#accc14ec480558af80be47abf1134daf0',1,'cv::ximgproc::ContourFitting::estimateTransformation(InputArray src, InputArray dst, OutputArray alphaPhiST, double &dist, bool fdContour=false)'],['https://docs.opencv.org/4.2.0/df/dfe/classcv_1_1ShapeTransformer.html#a84a188b7268a28a7b99260307bb38fcc',1,'cv::ShapeTransformer::estimateTransformation()']]], + ['estimateuncertainties_298',['estimateUncertainties',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a9f80a603d0bfeb29a52e0c3ffa01b013',1,'cv::omnidir::internal']]], + ['estimateuncertaintiesstereo_299',['estimateUncertaintiesStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#afc136088b0f942287339de93bc150f9f',1,'cv::omnidir::internal']]], + ['estimation_300',['Estimation',['https://docs.opencv.org/4.2.0/d5/dab/tutorial_sfm_trajectory_estimation.html',1,'Camera Motion Estimation'],['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'CNN for 3D Object Classification and Pose Estimation'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html',1,'Global Motion Estimation'],['https://docs.opencv.org/4.2.0/d9/de0/group__datasets__hpe.html',1,'Human Pose Estimation'],['https://docs.opencv.org/4.2.0/d7/d53/tutorial_py_pose.html',1,'Pose Estimation'],['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html',1,'Robust Estimation'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html',1,'Rotation Estimation'],['https://docs.opencv.org/4.2.0/d9/d24/group__stitching__seam.html',1,'Seam Estimation']]], + ['estimation_20api_301',['3D object recognition and pose estimation API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'']]], + ['estimation_20of_20a_20textured_20object_302',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], + ['estimator_303',['Estimator',['https://docs.opencv.org/4.2.0/df/d15/classcv_1_1detail_1_1Estimator.html',1,'cv::detail']]], + ['estimator_304',['estimator',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a5a9a51ac0f2fab42c1d694f88e1d6c2d',1,'cv::Stitcher::estimator()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad872c75dcdf2b2006b24b7bc05079ac9',1,'cv::Stitcher::estimator() const']]], + ['euclideantohomogeneous_305',['euclideanToHomogeneous',['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#gaed1efbb8c79c48bfaaa78118bf2c3694',1,'cv::sfm::euclideanToHomogeneous()'],['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html#gaed1efbb8c79c48bfaaa78118bf2c3694',1,'euclideanToHomogeneous()(Global Namespace)']]], + ['euler_306',['euler',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#ad9b527f26b444a0a139f4b99d0134812',1,'cv::text::ERStat']]], + ['eulerangles_307',['eulerAngles',['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga17994d2e81b723295f5bc3b1f862ed3b',1,'Eigen::MatrixBase::eulerAngles()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga17994d2e81b723295f5bc3b1f862ed3b',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::eulerAngles()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga17994d2e81b723295f5bc3b1f862ed3b',1,'MatrixBase< Solve< Decomposition, RhsType > >::eulerAngles()'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html#ga17994d2e81b723295f5bc3b1f862ed3b',1,'eulerAngles()(Global Namespace)']]], + ['eulerangles_5ft_308',['eulerangles_t',['../structnavtypes_1_1eulerangles__t.html',1,'navtypes']]], + ['euleranglestoquat_309',['eulerAnglesToQuat',['../namespaceutil.html#afe82846305c20a7bcdcb348b11b68ad4',1,'util']]], + ['eval_310',['eval',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html#a766941830e3622de365cafb87b20d0b8',1,'cv::BaseClassifier::eval()'],['https://docs.opencv.org/4.2.0/d0/d4f/classcv_1_1text_1_1ERFilter_1_1Callback.html#a6ba6d064e87f1c1a2660df7ebd2f942c',1,'cv::text::ERFilter::Callback::eval()'],['https://docs.opencv.org/4.2.0/db/dc0/classcv_1_1text_1_1OCRHMMDecoder_1_1ClassifierCallback.html#a25fb8e9d78d17da4ec525f00cb8a434c',1,'cv::text::OCRHMMDecoder::ClassifierCallback::eval()'],['https://docs.opencv.org/4.2.0/de/d2d/classcv_1_1text_1_1OCRBeamSearchDecoder_1_1ClassifierCallback.html#a9d7e439c966917e79ff93542339345a5',1,'cv::text::OCRBeamSearchDecoder::ClassifierCallback::eval()'],['https://docs.opencv.org/4.2.0/d7/dd9/classcv_1_1ClassifierThreshold.html#a97e554d46f32c37c9f3f8f2d0de0e72f',1,'cv::ClassifierThreshold::eval()'],['https://docs.opencv.org/4.2.0/d3/d52/classcv_1_1CvHaarEvaluator_1_1FeatureHaar.html#aa6f4ea04e5ad2fbef12fe2a6c13d1848',1,'cv::CvHaarEvaluator::FeatureHaar::eval()'],['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html#a24e31ac70362133d820b5cc917b8c945',1,'cv::StrongClassifierDirectSelection::eval()'],['https://docs.opencv.org/4.2.0/da/d94/classcv_1_1WeakClassifierHaarFeature.html#a34506482d31d1515dd89abd04eba2376',1,'cv::WeakClassifierHaarFeature::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1BaseExpr.html#a4149f50157823063e59c18ce04ed2496',1,'Eigen::symbolic::BaseExpr::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1BaseExpr.html#a4149f50157823063e59c18ce04ed2496',1,'BaseExpr< SymbolExpr< tag > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa73e57a2f0f7cfcb4ad4d55ea0b6414b',1,'Eigen::DenseBase::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa73e57a2f0f7cfcb4ad4d55ea0b6414b',1,'DenseBase< ArrayWrapper< ExpressionType > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa73e57a2f0f7cfcb4ad4d55ea0b6414b',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa73e57a2f0f7cfcb4ad4d55ea0b6414b',1,'DenseBase< Solve< Decomposition, RhsType > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a761bd872a06b59632fcff7b7807a77ce',1,'Eigen::SparseMatrixBase::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a761bd872a06b59632fcff7b7807a77ce',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a761bd872a06b59632fcff7b7807a77ce',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a761bd872a06b59632fcff7b7807a77ce',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a761bd872a06b59632fcff7b7807a77ce',1,'SparseMatrixBase< Transpose< MatrixType > >::eval()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a761bd872a06b59632fcff7b7807a77ce',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::eval()']]], + ['evalbeforeassigningbit_311',['EvalBeforeAssigningBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gae4b8ae7db0d83f9bbed26b261e60e139',1,'Eigen::EvalBeforeAssigningBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gae4b8ae7db0d83f9bbed26b261e60e139',1,'EvalBeforeAssigningBit(Global Namespace)']]], + ['evalbeforenestingbit_312',['EvalBeforeNestingBit',['https://eigen.tuxfamily.org/dox/group__flags.html#gaa34e83bae46a8eeae4e69ebe3aaecbed',1,'Eigen::EvalBeforeNestingBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#gaa34e83bae46a8eeae4e69ebe3aaecbed',1,'EvalBeforeNestingBit(Global Namespace)']]], + ['evalto_313',['evalTo',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a604d4f76a376ced36f8b9c3374c76c3e',1,'Eigen::TriangularBase::evalTo()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a604d4f76a376ced36f8b9c3374c76c3e',1,'TriangularBase< SelfAdjointView< _MatrixType, UpLo > >::evalTo()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a604d4f76a376ced36f8b9c3374c76c3e',1,'TriangularBase< SelfAdjointView< const Derived, UpLo > >::evalTo()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#a604d4f76a376ced36f8b9c3374c76c3e',1,'TriangularBase< TriangularView< _MatrixType, _Mode > >::evalTo()']]], + ['evaltolazy_314',['evalToLazy',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#ab8db3e55eee50cdc56650b3498e235eb',1,'Eigen::TriangularBase::evalToLazy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#ab8db3e55eee50cdc56650b3498e235eb',1,'TriangularBase< SelfAdjointView< _MatrixType, UpLo > >::evalToLazy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#ab8db3e55eee50cdc56650b3498e235eb',1,'TriangularBase< SelfAdjointView< const Derived, UpLo > >::evalToLazy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularBase.html#ab8db3e55eee50cdc56650b3498e235eb',1,'TriangularBase< TriangularView< _MatrixType, _Mode > >::evalToLazy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#ab8db3e55eee50cdc56650b3498e235eb',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::evalToLazy()']]], + ['evaluatefeaturedetector_315',['evaluateFeatureDetector',['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#gac78532caa0ee7744ab370c9a479ec397',1,'cv::evaluateFeatureDetector()'],['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#gac78532caa0ee7744ab370c9a479ec397',1,'evaluateFeatureDetector(const Mat &img1, const Mat &img2, const Mat &H1to2, std::vector< KeyPoint > *keypoints1, std::vector< KeyPoint > *keypoints2, float &repeatability, int &correspCount, const Ptr< FeatureDetector > &fdetector=Ptr< FeatureDetector >())(Global Namespace)']]], + ['evaluation_20and_20aliasing_316',['Lazy Evaluation and Aliasing',['https://eigen.tuxfamily.org/dox/TopicLazyEvaluation.html',1,'']]], + ['evenlevels_317',['evenLevels',['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga2f2cbd21dc6d7367a7c4ee1a826f389d',1,'cv::cuda::evenLevels()'],['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html#ga2f2cbd21dc6d7367a7c4ee1a826f389d',1,'evenLevels()(Global Namespace)']]], + ['event_318',['Event',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html',1,'cv::cuda::Event'],['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#a88b24ea26be108a2974abe6705d2a56e',1,'cv::cuda::Event::Event()']]], + ['event_319',['event',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'basic_ios< char, _Traits >::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'basic_iostream< char >::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'basic_istream< char >::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'basic_istream< char, _Traits >::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'basic_ostream< char >::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'basic_ostream< char, _Traits >::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_fstream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_ifstream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_ios::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_iostream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_istream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_istringstream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_ofstream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_ostream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_ostringstream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::basic_stringstream::event'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a411605aa4a6914dded5a9308ce28257b',1,'std::ios_base::event']]], + ['event_5fcallback_320',['event_callback',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'basic_ios< char, _Traits >::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'basic_iostream< char >::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'basic_istream< char >::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'basic_istream< char, _Traits >::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'basic_ostream< char >::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'basic_ostream< char, _Traits >::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_fstream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_ifstream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_ios::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_iostream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_istream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_istringstream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_ofstream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_ostream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_ostringstream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::basic_stringstream::event_callback'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a6c6b4d6e83f6adabb3e089e3c0725eae',1,'std::ios_base::event_callback']]], + ['event_5fflag_5faltkey_321',['EVENT_FLAG_ALTKEY',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25ceadb29046ba08e95d11696fdfd1ddb61bb',1,'cv::EVENT_FLAG_ALTKEY'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25ceadb29046ba08e95d11696fdfd1ddb61bb',1,'EVENT_FLAG_ALTKEY(Global Namespace)']]], + ['event_5fflag_5fctrlkey_322',['EVENT_FLAG_CTRLKEY',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea5876848aeb4e7cc282d461f94e45a07f',1,'cv::EVENT_FLAG_CTRLKEY'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea5876848aeb4e7cc282d461f94e45a07f',1,'EVENT_FLAG_CTRLKEY(Global Namespace)']]], + ['event_5fflag_5flbutton_323',['EVENT_FLAG_LBUTTON',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cead9b7a4f148eeff7eca24609f7a64adb1',1,'cv::EVENT_FLAG_LBUTTON'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cead9b7a4f148eeff7eca24609f7a64adb1',1,'EVENT_FLAG_LBUTTON(Global Namespace)']]], + ['event_5fflag_5fmbutton_324',['EVENT_FLAG_MBUTTON',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea9879aaef8e0ee2e8b8c9901774bfd594',1,'cv::EVENT_FLAG_MBUTTON'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea9879aaef8e0ee2e8b8c9901774bfd594',1,'EVENT_FLAG_MBUTTON(Global Namespace)']]], + ['event_5fflag_5frbutton_325',['EVENT_FLAG_RBUTTON',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea1bf3e58fcb83ff3e93cdd425299a9ff4',1,'cv::EVENT_FLAG_RBUTTON'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea1bf3e58fcb83ff3e93cdd425299a9ff4',1,'EVENT_FLAG_RBUTTON(Global Namespace)']]], + ['event_5fflag_5fshiftkey_326',['EVENT_FLAG_SHIFTKEY',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea61da926b22fd4fd3aa226ef1d2893102',1,'cv::EVENT_FLAG_SHIFTKEY'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ggaab4dc057947f70058c80626c9f1c25cea61da926b22fd4fd3aa226ef1d2893102',1,'EVENT_FLAG_SHIFTKEY(Global Namespace)']]], + ['event_5flbuttondblclk_327',['EVENT_LBUTTONDBLCLK',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0ad3b2124722127f85f6b335aee8ae5fcc',1,'cv::EVENT_LBUTTONDBLCLK'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0ad3b2124722127f85f6b335aee8ae5fcc',1,'EVENT_LBUTTONDBLCLK(Global Namespace)']]], + ['event_5flbuttondown_328',['EVENT_LBUTTONDOWN',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0ad3419100fc2d7688c6dbe3da030fbfd9',1,'cv::EVENT_LBUTTONDOWN'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0ad3419100fc2d7688c6dbe3da030fbfd9',1,'EVENT_LBUTTONDOWN(Global Namespace)']]], + ['event_5flbuttonup_329',['EVENT_LBUTTONUP',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a59cad7ffe959adf2782a110196d47bf6',1,'cv::EVENT_LBUTTONUP'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a59cad7ffe959adf2782a110196d47bf6',1,'EVENT_LBUTTONUP(Global Namespace)']]], + ['event_5fmbuttondblclk_330',['EVENT_MBUTTONDBLCLK',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0afeedd6a768596d14c81bf304760edfe4',1,'cv::EVENT_MBUTTONDBLCLK'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0afeedd6a768596d14c81bf304760edfe4',1,'EVENT_MBUTTONDBLCLK(Global Namespace)']]], + ['event_5fmbuttondown_331',['EVENT_MBUTTONDOWN',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a1dd67e6d96873c36dd3a9670e8312a28',1,'cv::EVENT_MBUTTONDOWN'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a1dd67e6d96873c36dd3a9670e8312a28',1,'EVENT_MBUTTONDOWN(Global Namespace)']]], + ['event_5fmbuttonup_332',['EVENT_MBUTTONUP',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0ab3fce84f2dca833e150779637db7dc1c',1,'cv::EVENT_MBUTTONUP'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0ab3fce84f2dca833e150779637db7dc1c',1,'EVENT_MBUTTONUP(Global Namespace)']]], + ['event_5fmousehwheel_333',['EVENT_MOUSEHWHEEL',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a8c85fc9f3e42b5f4baab925cc5cce753',1,'cv::EVENT_MOUSEHWHEEL'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a8c85fc9f3e42b5f4baab925cc5cce753',1,'EVENT_MOUSEHWHEEL(Global Namespace)']]], + ['event_5fmousemove_334',['EVENT_MOUSEMOVE',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a8f2ec5fd35fe3f4b696518b146dcf675',1,'cv::EVENT_MOUSEMOVE'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a8f2ec5fd35fe3f4b696518b146dcf675',1,'EVENT_MOUSEMOVE(Global Namespace)']]], + ['event_5fmousewheel_335',['EVENT_MOUSEWHEEL',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a402b86eed36ef6cc00cb7425e817af66',1,'cv::EVENT_MOUSEWHEEL'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a402b86eed36ef6cc00cb7425e817af66',1,'EVENT_MOUSEWHEEL(Global Namespace)']]], + ['event_5frbuttondblclk_336',['EVENT_RBUTTONDBLCLK',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a32fba0899e8c3664d5252c059ce83d75',1,'cv::EVENT_RBUTTONDBLCLK'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0a32fba0899e8c3664d5252c059ce83d75',1,'EVENT_RBUTTONDBLCLK(Global Namespace)']]], + ['event_5frbuttondown_337',['EVENT_RBUTTONDOWN',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0aa3536f83b6f48da5121041f58fc7a683',1,'cv::EVENT_RBUTTONDOWN'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0aa3536f83b6f48da5121041f58fc7a683',1,'EVENT_RBUTTONDOWN(Global Namespace)']]], + ['event_5frbuttonup_338',['EVENT_RBUTTONUP',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0aacdda7d94278928c34b61a7bd8be9f62',1,'cv::EVENT_RBUTTONUP'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#gga927593befdddc7e7013602bca9b079b0aacdda7d94278928c34b61a7bd8be9f62',1,'EVENT_RBUTTONUP(Global Namespace)']]], + ['eventaccessor_339',['EventAccessor',['https://docs.opencv.org/4.2.0/da/d71/structcv_1_1cuda_1_1EventAccessor.html',1,'cv::cuda::EventAccessor'],['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa2076bfa2bf524ce953940722f01f158',1,'cv::cuda::Event::EventAccessor']]], + ['eventid_5ft_340',['eventid_t',['../classutil_1_1PeriodicScheduler.html#a80faf4ffb1eed4e2d2ac9984be201d55',1,'util::PeriodicScheduler']]], + ['exact_5ftag_341',['exact_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09735.html',1,'__gnu_parallel']]], + ['example_342',['Example',['../cameraconfig.html#example',1,'']]], + ['example_343',['What happens inside Eigen, on a simple example',['https://eigen.tuxfamily.org/dox/TopicInsideEigenExample.html',1,'']]], + ['exception_344',['Exception',['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html',1,'cv::Exception'],['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a59759ca13add62a2bdd1fb7605d675dc',1,'cv::Exception::Exception()'],['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a95c2117604b1d51c17e5ccd540f448b9',1,'cv::Exception::Exception(int _code, const String &_err, const String &_func, const String &_file, int _line)']]], + ['exception_345',['exception',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05487.html',1,'std::exception'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00026.html',1,'(Global Namespace)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a14824c27188d2fee4861806cd5f23d22.html#a14824c27188d2fee4861806cd5f23d22',1,'nlohmann::basic_json::exception']]], + ['exception_2eh_346',['exception.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00329.html',1,'']]], + ['exception_2ehpp_347',['exception.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01118.html',1,'']]], + ['exception_5fdefines_2eh_348',['exception_defines.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00332.html',1,'']]], + ['exception_5fptr_349',['exception_ptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05491.html',1,'std::__exception_ptr']]], + ['exception_5fptr_2eh_350',['exception_ptr.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00335.html',1,'']]], + ['exception_5fptr_2ehpp_351',['exception_ptr.hpp',['https://docs.opencv.org/4.2.0/dc/d0b/exception__ptr_8hpp.html',1,'']]], + ['exceptions_352',['Exceptions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01533.html',1,'Exceptions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01495.html',1,'Exceptions']]], + ['exceptions_353',['exceptions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'basic_ios< char, _Traits >::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'basic_ios< char, _Traits >::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'basic_iostream< char >::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'basic_iostream< char >::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'basic_istream< char >::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'basic_istream< char >::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'basic_istream< char, _Traits >::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'basic_istream< char, _Traits >::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'basic_ostream< char >::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'basic_ostream< char >::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'basic_ostream< char, _Traits >::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'basic_ostream< char, _Traits >::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_fstream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_fstream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_ifstream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_ifstream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_ios::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_ios::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_iostream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_iostream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_istream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_istream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_istringstream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_istringstream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_ofstream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_ofstream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_ostream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_ostream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_ostringstream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_ostringstream::exceptions(iostate __except)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a2af07612846b93cd56e19d56ad9ee7c5',1,'std::basic_stringstream::exceptions() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#aecd6ac5df7374c8b775a2912c4a014e9',1,'std::basic_stringstream::exceptions(iostate __except)']]], + ['exchange_354',['exchange',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a38a02a658328c056688ab79c7ab7bbf6',1,'std']]], + ['exec_5fkernel_355',['EXEC_KERNEL',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a3d1e337952cb697c25cde44a97112646acc62899c052a7270c485b7f13b80decb',1,'cv::ocl::Device']]], + ['exec_5fnative_5fkernel_356',['EXEC_NATIVE_KERNEL',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a3d1e337952cb697c25cde44a97112646a24f564396eb16e7ba60abaa27c0f36a7',1,'cv::ocl::Device']]], + ['executioncapabilities_357',['executionCapabilities',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a22d4914fb1618bf5d0e01e23320f45af',1,'cv::ocl::Device']]], + ['existingvertexgain_358',['existingVertexGain',['https://docs.opencv.org/4.2.0/d2/dd1/structcv_1_1CirclesGridFinderParameters.html#a0befaa37a55a449fd0f6cca94b5ed039',1,'cv::CirclesGridFinderParameters']]], + ['exists_359',['exists',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#a121000e13a76df1f238633a34281544d',1,'cv::utils::fs']]], + ['exp_360',['exp',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a70901e189e876f64d7f3fee1dbe942cc',1,'Eigen::MatrixBase::exp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a70901e189e876f64d7f3fee1dbe942cc',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::exp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a70901e189e876f64d7f3fee1dbe942cc',1,'MatrixBase< Solve< Decomposition, RhsType > >::exp()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga1eb07a682abff20e0864104599c06fbc',1,'cv::exp(const softfloat &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga21c119788f779f9e631161ffa354bbe5',1,'cv::exp(const softdouble &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3e10108e2162c338f1b848af619f39e5',1,'cv::exp(InputArray src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gac6e51541d3bb0a7a396128e4d5919b61',1,'cv::cuda::exp()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2377d17f34d96b5f90f3b1784aadc35d',1,'cv::cudev::exp(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b358174009d257885162cb85b03b10b',1,'cv::cudev::exp(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbd9e2a1dbb91a8a01cf96a874240944',1,'cv::cudev::exp(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga238d045995de8c2d718d1c9db47b7782',1,'cv::cudev::exp(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d30ba4a9e173be4de55e08e5bbb2c6a',1,'cv::cudev::exp(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae05e5efc45f1df3f5eed0ff20518e979',1,'cv::cudev::exp(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6225d1b57fb5da5dba8235a9c4e857e',1,'cv::cudev::exp(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40e6779d89d96440297b1721951bf84b',1,'cv::cudev::exp(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3936a08d28214eaca4bff1697eb439f',1,'cv::cudev::exp(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab49a7cb8733a9b4a91f4714992648600',1,'cv::cudev::exp(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1a77bcf816c20e9632c673001f281a0',1,'cv::cudev::exp(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9abd1ce69af14655baf0066944c2e2e4',1,'cv::cudev::exp(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5ca8ce32340a164855907fd13745e9c',1,'cv::cudev::exp(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0582d9c40b908171cecc7125aabcbb5d',1,'cv::cudev::exp(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d65f98c9682e2f343c12a3d78aec659',1,'cv::cudev::exp(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c75c53ddef77b4dde48324a8586de0c',1,'cv::cudev::exp(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ba751a8e12763b2ae5aa1be00b37a4e',1,'cv::cudev::exp(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54bc788ca46283afd03d58dc874e7388',1,'cv::cudev::exp(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b0db52fc67c721428bf8ee87d826f45',1,'cv::cudev::exp(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad41463837e6bdf4dd027b2ad1338b1df',1,'cv::cudev::exp(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2060dac1ca605f356217a1a7218f03b',1,'cv::cudev::exp(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa96ec0c7b40b32edd894e8eb0dd1e739',1,'cv::cudev::exp(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d0697aef6fb1e0eeae961417ab75aa0',1,'cv::cudev::exp(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dd48c7f9c9403b89cab831a3630861f',1,'cv::cudev::exp(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9cb3d8d68295eb8790f703a3a3960c2',1,'cv::cudev::exp(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fa2016a9697a2596f36d3ba7cebc9e0',1,'cv::cudev::exp(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada227385730cf553185f701c3eb4e0b',1,'cv::cudev::exp(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1ec67b22125821a631e92b145e0e9f',1,'cv::cudev::exp(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5123c41d3e50fcf7b7a9c33f897ca7a',1,'cv::cudev::exp(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f770d0cffaa71a1684699e619e67c84',1,'cv::cudev::exp(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32059ab5b7bb5109be82136693e50968',1,'cv::cudev::exp(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1196db753b3bb292dd414c58c750c2f',1,'cv::cudev::exp(const double4 &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3e10108e2162c338f1b848af619f39e5',1,'exp(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga1eb07a682abff20e0864104599c06fbc',1,'exp(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga21c119788f779f9e631161ffa354bbe5',1,'exp(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gac6e51541d3bb0a7a396128e4d5919b61',1,'exp(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2377d17f34d96b5f90f3b1784aadc35d',1,'exp(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b358174009d257885162cb85b03b10b',1,'exp(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbd9e2a1dbb91a8a01cf96a874240944',1,'exp(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga238d045995de8c2d718d1c9db47b7782',1,'exp(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d30ba4a9e173be4de55e08e5bbb2c6a',1,'exp(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae05e5efc45f1df3f5eed0ff20518e979',1,'exp(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6225d1b57fb5da5dba8235a9c4e857e',1,'exp(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40e6779d89d96440297b1721951bf84b',1,'exp(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3936a08d28214eaca4bff1697eb439f',1,'exp(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab49a7cb8733a9b4a91f4714992648600',1,'exp(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1a77bcf816c20e9632c673001f281a0',1,'exp(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9abd1ce69af14655baf0066944c2e2e4',1,'exp(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5ca8ce32340a164855907fd13745e9c',1,'exp(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0582d9c40b908171cecc7125aabcbb5d',1,'exp(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d65f98c9682e2f343c12a3d78aec659',1,'exp(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c75c53ddef77b4dde48324a8586de0c',1,'exp(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ba751a8e12763b2ae5aa1be00b37a4e',1,'exp(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54bc788ca46283afd03d58dc874e7388',1,'exp(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b0db52fc67c721428bf8ee87d826f45',1,'exp(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad41463837e6bdf4dd027b2ad1338b1df',1,'exp(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2060dac1ca605f356217a1a7218f03b',1,'exp(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa96ec0c7b40b32edd894e8eb0dd1e739',1,'exp(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d0697aef6fb1e0eeae961417ab75aa0',1,'exp(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dd48c7f9c9403b89cab831a3630861f',1,'exp(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9cb3d8d68295eb8790f703a3a3960c2',1,'exp(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fa2016a9697a2596f36d3ba7cebc9e0',1,'exp(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada227385730cf553185f701c3eb4e0b',1,'exp(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1ec67b22125821a631e92b145e0e9f',1,'exp(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5123c41d3e50fcf7b7a9c33f897ca7a',1,'exp(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f770d0cffaa71a1684699e619e67c84',1,'exp(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32059ab5b7bb5109be82136693e50968',1,'exp(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1196db753b3bb292dd414c58c750c2f',1,'exp(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga89579637d83fe041c9963cdcab272edd',1,'std::exp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga89579637d83fe041c9963cdcab272edd',1,'exp()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae491aecf7dab66ac7e11008c5766694d',1,'Eigen::exp()']]], + ['exp10_361',['exp10',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e8d8445d8ba8494f34353953065d05f',1,'cv::cudev::exp10(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada34819d02d15ad7db15a47d89df00d4',1,'cv::cudev::exp10(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1fffbb175f687b77191fb3d8dd685db',1,'cv::cudev::exp10(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdeb7dcb1a21bd9bccb13077611b8308',1,'cv::cudev::exp10(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4a3c09f0eded1c171575e81b36de72',1,'cv::cudev::exp10(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51d734d6b73b0247a35adcade02ab63',1,'cv::cudev::exp10(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga942543d60f12bf35f3dc205f2b590136',1,'cv::cudev::exp10(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac04817f53b09461b85df37d40ac26fba',1,'cv::cudev::exp10(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga740dbfd512f4b532c2e43b9502548489',1,'cv::cudev::exp10(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46b05046ddd286b98c2512bd85dbb640',1,'cv::cudev::exp10(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac64053203d70b199ce495f0da2201079',1,'cv::cudev::exp10(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22ab0a16ea4d467fd2fec0fd03b2462d',1,'cv::cudev::exp10(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18635fa94383efa3b5a2aab90d10b6ea',1,'cv::cudev::exp10(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d67bf499b08d68208c2439f85a6639',1,'cv::cudev::exp10(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09482b0315238fd82dba615ab0ff35fd',1,'cv::cudev::exp10(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5859bab52316181a06497a34ba4adc61',1,'cv::cudev::exp10(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1698e5efac86374421dbb69f4142980',1,'cv::cudev::exp10(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74967e8c51deea918e741ea497d01c4f',1,'cv::cudev::exp10(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga939ec6f7b0daeddf0431015b99aaee27',1,'cv::cudev::exp10(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cf829e6396673dc7642446cc0206f1',1,'cv::cudev::exp10(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d5880cfcd44f375b03416cbff831560',1,'cv::cudev::exp10(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60351faa9a42c500ea9ff576a9ccc273',1,'cv::cudev::exp10(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad313e1636031d9f548abcb0dd3fb204a',1,'cv::cudev::exp10(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga645e621b4728b1017a0c663056f3afca',1,'cv::cudev::exp10(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e6f286caaca38d2ad0daa42319c0dbb',1,'cv::cudev::exp10(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4e2ac6e27ff0e5fb0a09c3d5741fae4',1,'cv::cudev::exp10(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83446bcd25b7f39d772539762f14867d',1,'cv::cudev::exp10(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a3b221843fb0fcf237dcd570a7cfcd5',1,'cv::cudev::exp10(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga702225daf1f8936a522bdc7c8af86cca',1,'cv::cudev::exp10(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e050d8f01de4d68e8d6c05e791ce672',1,'cv::cudev::exp10(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea63381243afdf21499c465336b17772',1,'cv::cudev::exp10(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8577a71d688dbd8f61cc3313a6099a13',1,'cv::cudev::exp10(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e8d8445d8ba8494f34353953065d05f',1,'exp10(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada34819d02d15ad7db15a47d89df00d4',1,'exp10(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1fffbb175f687b77191fb3d8dd685db',1,'exp10(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdeb7dcb1a21bd9bccb13077611b8308',1,'exp10(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4a3c09f0eded1c171575e81b36de72',1,'exp10(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51d734d6b73b0247a35adcade02ab63',1,'exp10(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga942543d60f12bf35f3dc205f2b590136',1,'exp10(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac04817f53b09461b85df37d40ac26fba',1,'exp10(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga740dbfd512f4b532c2e43b9502548489',1,'exp10(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46b05046ddd286b98c2512bd85dbb640',1,'exp10(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac64053203d70b199ce495f0da2201079',1,'exp10(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22ab0a16ea4d467fd2fec0fd03b2462d',1,'exp10(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18635fa94383efa3b5a2aab90d10b6ea',1,'exp10(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d67bf499b08d68208c2439f85a6639',1,'exp10(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09482b0315238fd82dba615ab0ff35fd',1,'exp10(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5859bab52316181a06497a34ba4adc61',1,'exp10(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1698e5efac86374421dbb69f4142980',1,'exp10(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74967e8c51deea918e741ea497d01c4f',1,'exp10(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga939ec6f7b0daeddf0431015b99aaee27',1,'exp10(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cf829e6396673dc7642446cc0206f1',1,'exp10(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d5880cfcd44f375b03416cbff831560',1,'exp10(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60351faa9a42c500ea9ff576a9ccc273',1,'exp10(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad313e1636031d9f548abcb0dd3fb204a',1,'exp10(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga645e621b4728b1017a0c663056f3afca',1,'exp10(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e6f286caaca38d2ad0daa42319c0dbb',1,'exp10(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4e2ac6e27ff0e5fb0a09c3d5741fae4',1,'exp10(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83446bcd25b7f39d772539762f14867d',1,'exp10(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a3b221843fb0fcf237dcd570a7cfcd5',1,'exp10(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga702225daf1f8936a522bdc7c8af86cca',1,'exp10(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e050d8f01de4d68e8d6c05e791ce672',1,'exp10(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea63381243afdf21499c465336b17772',1,'exp10(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8577a71d688dbd8f61cc3313a6099a13',1,'exp10(const double4 &a)(Global Namespace)']]], + ['exp10_5f_362',['exp10_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac54b1a240e793afb049c168db401bf18',1,'cv::cudev::exp10_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac54b1a240e793afb049c168db401bf18',1,'exp10_()(Global Namespace)']]], + ['exp10_5ffunc_363',['exp10_func',['https://docs.opencv.org/4.2.0/dc/d8b/structcv_1_1cudev_1_1exp10__func.html',1,'cv::cudev']]], + ['exp10_5ffunc_3c_20double_20_3e_364',['exp10_func< double >',['https://docs.opencv.org/4.2.0/d0/d66/structcv_1_1cudev_1_1exp10__func_3_01double_01_4.html',1,'cv::cudev']]], + ['exp10_5ffunc_3c_20float_20_3e_365',['exp10_func< float >',['https://docs.opencv.org/4.2.0/d4/d78/structcv_1_1cudev_1_1exp10__func_3_01float_01_4.html',1,'cv::cudev']]], + ['exp10_5ffunc_3c_20schar_20_3e_366',['exp10_func< schar >',['https://docs.opencv.org/4.2.0/d6/dde/structcv_1_1cudev_1_1exp10__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['exp10_5ffunc_3c_20short_20_3e_367',['exp10_func< short >',['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1exp10__func_3_01short_01_4.html',1,'cv::cudev']]], + ['exp10_5ffunc_3c_20uchar_20_3e_368',['exp10_func< uchar >',['https://docs.opencv.org/4.2.0/d1/ddd/structcv_1_1cudev_1_1exp10__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['exp10_5ffunc_3c_20uint_20_3e_369',['exp10_func< uint >',['https://docs.opencv.org/4.2.0/d5/dc3/structcv_1_1cudev_1_1exp10__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['exp10_5ffunc_3c_20ushort_20_3e_370',['exp10_func< ushort >',['https://docs.opencv.org/4.2.0/d4/da4/structcv_1_1cudev_1_1exp10__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['exp2_371',['exp2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9b7aa19a64d7bcbca413f4f4d8d2cf2',1,'cv::cudev::exp2(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf3968a555f44ca7132a8c2c8b3f57b5',1,'cv::cudev::exp2(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ea3b79c9d61492a57fe3e2c4d3fe5ae',1,'cv::cudev::exp2(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab989dea5502f8e91da3ce610f235e0df',1,'cv::cudev::exp2(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45083bc0f533f599f81d75764907691b',1,'cv::cudev::exp2(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c11941f60a883451241900dd099c247',1,'cv::cudev::exp2(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd9b56a3b5be0cc0b0d56cdae02c7997',1,'cv::cudev::exp2(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac82f0768e06f8babc9a4fe930c76ae04',1,'cv::cudev::exp2(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0af32b7ffb0a4289aa399a151ae413b',1,'cv::cudev::exp2(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1283b9dc5979601664c1e853d6621c3f',1,'cv::cudev::exp2(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3deed18ea8891632503291df38b7beee',1,'cv::cudev::exp2(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f959da99631ae34637a0260e799e764',1,'cv::cudev::exp2(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e114d6062e2d9f61881a4fd21449d18',1,'cv::cudev::exp2(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07d572e6e4d6776518d1a8925e75e76f',1,'cv::cudev::exp2(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5ebe0f69bcafbe346c0b2bcc128e2df',1,'cv::cudev::exp2(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c40e6fde70f04a3ef05f12c160d468d',1,'cv::cudev::exp2(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43945f5444ae297ed58552731b5d632d',1,'cv::cudev::exp2(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf552f30a3d4cca247ff15108f7b96f72',1,'cv::cudev::exp2(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77cb9fcafeb63854be7f1dc522232a6b',1,'cv::cudev::exp2(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaad136d6b4eed3f770b151e8977b6ee4',1,'cv::cudev::exp2(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92dd79ef4f5710467fe2c9f16caee2ce',1,'cv::cudev::exp2(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47d823d1e258fdd14bdbf90ccc0659f7',1,'cv::cudev::exp2(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga525418a284d82325041fc2cdc3d0a809',1,'cv::cudev::exp2(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30aa1bdd46990cec246e4f719fadbb2b',1,'cv::cudev::exp2(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95126b77d73ae635289029cf4741a3ff',1,'cv::cudev::exp2(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b46ad8b62f94727aa47362edad8a74',1,'cv::cudev::exp2(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395ce17064a9546a41c07de53ed639d8',1,'cv::cudev::exp2(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc9b37e507c31c8ed9f0283e9c4d9a9d',1,'cv::cudev::exp2(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c71ac2024def7d833d369b1f98549c5',1,'cv::cudev::exp2(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f639ed805f238ccbc4145fd5edcde1c',1,'cv::cudev::exp2(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1f91ddf3cffefbde28e809522d10642',1,'cv::cudev::exp2(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9dc14185347dfd6f9b6d609e813e14e5',1,'cv::cudev::exp2(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9b7aa19a64d7bcbca413f4f4d8d2cf2',1,'exp2(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf3968a555f44ca7132a8c2c8b3f57b5',1,'exp2(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ea3b79c9d61492a57fe3e2c4d3fe5ae',1,'exp2(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab989dea5502f8e91da3ce610f235e0df',1,'exp2(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45083bc0f533f599f81d75764907691b',1,'exp2(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c11941f60a883451241900dd099c247',1,'exp2(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd9b56a3b5be0cc0b0d56cdae02c7997',1,'exp2(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac82f0768e06f8babc9a4fe930c76ae04',1,'exp2(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0af32b7ffb0a4289aa399a151ae413b',1,'exp2(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1283b9dc5979601664c1e853d6621c3f',1,'exp2(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3deed18ea8891632503291df38b7beee',1,'exp2(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f959da99631ae34637a0260e799e764',1,'exp2(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e114d6062e2d9f61881a4fd21449d18',1,'exp2(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07d572e6e4d6776518d1a8925e75e76f',1,'exp2(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5ebe0f69bcafbe346c0b2bcc128e2df',1,'exp2(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c40e6fde70f04a3ef05f12c160d468d',1,'exp2(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43945f5444ae297ed58552731b5d632d',1,'exp2(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf552f30a3d4cca247ff15108f7b96f72',1,'exp2(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77cb9fcafeb63854be7f1dc522232a6b',1,'exp2(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaad136d6b4eed3f770b151e8977b6ee4',1,'exp2(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92dd79ef4f5710467fe2c9f16caee2ce',1,'exp2(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47d823d1e258fdd14bdbf90ccc0659f7',1,'exp2(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga525418a284d82325041fc2cdc3d0a809',1,'exp2(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30aa1bdd46990cec246e4f719fadbb2b',1,'exp2(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95126b77d73ae635289029cf4741a3ff',1,'exp2(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b46ad8b62f94727aa47362edad8a74',1,'exp2(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395ce17064a9546a41c07de53ed639d8',1,'exp2(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc9b37e507c31c8ed9f0283e9c4d9a9d',1,'exp2(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c71ac2024def7d833d369b1f98549c5',1,'exp2(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f639ed805f238ccbc4145fd5edcde1c',1,'exp2(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1f91ddf3cffefbde28e809522d10642',1,'exp2(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9dc14185347dfd6f9b6d609e813e14e5',1,'exp2(const double1 &a)(Global Namespace)']]], + ['exp2_5f_372',['exp2_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab158beace2700c9cbce864f538c0a563',1,'cv::cudev::exp2_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab158beace2700c9cbce864f538c0a563',1,'exp2_()(Global Namespace)']]], + ['exp2_5ffunc_373',['exp2_func',['https://docs.opencv.org/4.2.0/dc/dd9/structcv_1_1cudev_1_1exp2__func.html',1,'cv::cudev']]], + ['exp2_5ffunc_3c_20double_20_3e_374',['exp2_func< double >',['https://docs.opencv.org/4.2.0/d8/d9b/structcv_1_1cudev_1_1exp2__func_3_01double_01_4.html',1,'cv::cudev']]], + ['exp2_5ffunc_3c_20float_20_3e_375',['exp2_func< float >',['https://docs.opencv.org/4.2.0/d8/dc7/structcv_1_1cudev_1_1exp2__func_3_01float_01_4.html',1,'cv::cudev']]], + ['exp2_5ffunc_3c_20schar_20_3e_376',['exp2_func< schar >',['https://docs.opencv.org/4.2.0/de/da5/structcv_1_1cudev_1_1exp2__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['exp2_5ffunc_3c_20short_20_3e_377',['exp2_func< short >',['https://docs.opencv.org/4.2.0/da/d29/structcv_1_1cudev_1_1exp2__func_3_01short_01_4.html',1,'cv::cudev']]], + ['exp2_5ffunc_3c_20uchar_20_3e_378',['exp2_func< uchar >',['https://docs.opencv.org/4.2.0/d2/d8b/structcv_1_1cudev_1_1exp2__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['exp2_5ffunc_3c_20uint_20_3e_379',['exp2_func< uint >',['https://docs.opencv.org/4.2.0/dc/dd4/structcv_1_1cudev_1_1exp2__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['exp2_5ffunc_3c_20ushort_20_3e_380',['exp2_func< ushort >',['https://docs.opencv.org/4.2.0/d9/d30/structcv_1_1cudev_1_1exp2__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['exp32f_381',['exp32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaaa6369f0c58d52fb7faca9d2b697479f',1,'cv::hal::exp32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaaa6369f0c58d52fb7faca9d2b697479f',1,'exp32f()(Global Namespace)']]], + ['exp64f_382',['exp64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6cbf3e40dc9952420ab8ef0a32d74f79',1,'cv::hal::exp64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6cbf3e40dc9952420ab8ef0a32d74f79',1,'exp64f()(Global Namespace)']]], + ['exp_5f_383',['exp_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22661f46425f6c9fe8d7a164c043ffb5',1,'cv::cudev::exp_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22661f46425f6c9fe8d7a164c043ffb5',1,'exp_()(Global Namespace)']]], + ['exp_5ffunc_384',['exp_func',['https://docs.opencv.org/4.2.0/dc/d73/structcv_1_1cudev_1_1exp__func.html',1,'cv::cudev']]], + ['exp_5ffunc_3c_20double_20_3e_385',['exp_func< double >',['https://docs.opencv.org/4.2.0/dd/db1/structcv_1_1cudev_1_1exp__func_3_01double_01_4.html',1,'cv::cudev']]], + ['exp_5ffunc_3c_20float_20_3e_386',['exp_func< float >',['https://docs.opencv.org/4.2.0/df/dba/structcv_1_1cudev_1_1exp__func_3_01float_01_4.html',1,'cv::cudev']]], + ['exp_5ffunc_3c_20schar_20_3e_387',['exp_func< schar >',['https://docs.opencv.org/4.2.0/d1/d33/structcv_1_1cudev_1_1exp__func_3_01schar_01_4.html',1,'cv::cudev']]], + ['exp_5ffunc_3c_20short_20_3e_388',['exp_func< short >',['https://docs.opencv.org/4.2.0/d7/d67/structcv_1_1cudev_1_1exp__func_3_01short_01_4.html',1,'cv::cudev']]], + ['exp_5ffunc_3c_20uchar_20_3e_389',['exp_func< uchar >',['https://docs.opencv.org/4.2.0/d9/de4/structcv_1_1cudev_1_1exp__func_3_01uchar_01_4.html',1,'cv::cudev']]], + ['exp_5ffunc_3c_20uint_20_3e_390',['exp_func< uint >',['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1exp__func_3_01uint_01_4.html',1,'cv::cudev']]], + ['exp_5ffunc_3c_20ushort_20_3e_391',['exp_func< ushort >',['https://docs.opencv.org/4.2.0/d6/dde/structcv_1_1cudev_1_1exp__func_3_01ushort_01_4.html',1,'cv::cudev']]], + ['expand_392',['expand',['https://docs.opencv.org/4.2.0/db/d27/structcv_1_1detail_1_1GCompoundCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01stdce2f32b5f5ee035f9c558a4fd2328de5.html#a3088ea01f13ee8d581eeb189670388b7',1,'cv::detail::GCompoundCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... > >']]], + ['expand_5fimpl_393',['expand_impl',['https://docs.opencv.org/4.2.0/db/d27/structcv_1_1detail_1_1GCompoundCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01stdce2f32b5f5ee035f9c558a4fd2328de5.html#a316f2951af9e7448ebc5ab4e81df3b0d',1,'cv::detail::GCompoundCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... > >']]], + ['expand_5fmat_394',['expand_mat',['https://docs.opencv.org/4.2.0/d6/d84/namespacecv_1_1quality_1_1quality__utils.html#a4bc8e62e8ba688115623e6e09affbdef',1,'cv::quality::quality_utils']]], + ['expanded_5fmat_5fdefault_5ftype_395',['EXPANDED_MAT_DEFAULT_TYPE',['https://docs.opencv.org/4.2.0/d6/d84/namespacecv_1_1quality_1_1quality__utils.html#af9e2ce343214a7e11a94f84d71b86d9d',1,'cv::quality::quality_utils']]], + ['experimental_396',['Experimental',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01524.html',1,'']]], + ['experimental_202d_20features_20algorithms_397',['Experimental 2D Features Algorithms',['https://docs.opencv.org/4.2.0/d7/d7a/group__xfeatures2d__experiment.html',1,'']]], + ['experimental_202d_20features_20matching_20algorithm_398',['Experimental 2D Features Matching Algorithm',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html',1,'']]], + ['experimental_20parts_20of_20eigen_399',['Experimental parts of Eigen',['https://eigen.tuxfamily.org/dox/Experimental.html',1,'']]], + ['experimental_2falgorithm_400',['experimental/algorithm',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16583.html',1,'']]], + ['experimental_2farray_401',['experimental/array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16601.html',1,'']]], + ['experimental_2fbits_2ffs_5fdir_2eh_402',['experimental/bits/fs_dir.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16916.html',1,'']]], + ['experimental_2fbits_2ffs_5ffwd_2eh_403',['experimental/bits/fs_fwd.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16922.html',1,'']]], + ['experimental_2fbits_2ffs_5fpath_2eh_404',['experimental/bits/fs_path.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16934.html',1,'']]], + ['experimental_2fbits_2fshared_5fptr_2eh_405',['experimental/bits/shared_ptr.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17231.html',1,'']]], + ['experimental_2fbits_2fstring_5fview_2etcc_406',['experimental/bits/string_view.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17276.html',1,'']]], + ['experimental_2fchrono_407',['experimental/chrono',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16628.html',1,'']]], + ['experimental_2fdeque_408',['experimental/deque',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16808.html',1,'']]], + ['experimental_2fforward_5flist_409',['experimental/forward_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16910.html',1,'']]], + ['experimental_2ffunctional_410',['experimental/functional',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16940.html',1,'']]], + ['experimental_2fiterator_411',['experimental/iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17033.html',1,'']]], + ['experimental_2flist_412',['experimental/list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17063.html',1,'']]], + ['experimental_2fmap_413',['experimental/map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17072.html',1,'']]], + ['experimental_2fmemory_414',['experimental/memory',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17084.html',1,'']]], + ['experimental_2fnumeric_415',['experimental/numeric',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17126.html',1,'']]], + ['experimental_2frandom_416',['experimental/random',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17171.html',1,'']]], + ['experimental_2fratio_417',['experimental/ratio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17183.html',1,'']]], + ['experimental_2fregex_418',['experimental/regex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17186.html',1,'']]], + ['experimental_2fset_419',['experimental/set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17219.html',1,'']]], + ['experimental_2fstring_420',['experimental/string',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17270.html',1,'']]], + ['experimental_2fsystem_5ferror_421',['experimental/system_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17279.html',1,'']]], + ['experimental_2ftuple_422',['experimental/tuple',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17324.html',1,'']]], + ['experimental_2ftype_5ftraits_423',['experimental/type_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17330.html',1,'']]], + ['experimental_2funordered_5fmap_424',['experimental/unordered_map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17339.html',1,'']]], + ['experimental_2funordered_5fset_425',['experimental/unordered_set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17348.html',1,'']]], + ['experimental_2futility_426',['experimental/utility',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17351.html',1,'']]], + ['experimental_2fvector_427',['experimental/vector',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17360.html',1,'']]], + ['expint_428',['expint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga88ba17f5d050a6973ca4db1bf6e90590',1,'std::expint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gac555d8d9bf9256070f2238a6a788727c',1,'std::tr1::expint()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga88ba17f5d050a6973ca4db1bf6e90590',1,'expint(_Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#gac555d8d9bf9256070f2238a6a788727c',1,'expint(_Tp __x)(Global Namespace)']]], + ['expintf_429',['expintf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga5842816f6eed2594e0a327df4e4a2a47',1,'std::expintf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga5842816f6eed2594e0a327df4e4a2a47',1,'expintf()(Global Namespace)']]], + ['expintl_430',['expintl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1329130b32328d0666e290ee5931fa4f',1,'std::expintl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1329130b32328d0666e290ee5931fa4f',1,'expintl(long double __x)(Global Namespace)']]], + ['explained_20with_20code_431',['Basic concepts of the homography explained with code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'']]], + ['explanation_20of_20the_20assertion_20on_20unaligned_20arrays_432',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], + ['expm1_433',['expm1',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae7cb2544e4e745bc0067fe793e3f2f81',1,'Eigen']]], + ['exponent_20calculation_434',['Exponent calculation',['https://docs.opencv.org/4.2.0/d4/d8a/group__core__hal__interface__exp.html',1,'']]], + ['exponential_5fdistribution_435',['exponential_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html',1,'std::exponential_distribution< _RealType >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a0d648c2fe97f6882eb362331d4fc4be9',1,'std::exponential_distribution::exponential_distribution()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a0da5c22c9ebe44479b181cce576f466e',1,'std::exponential_distribution::exponential_distribution(_RealType __lambda)']]], + ['exporting_20a_20template_20parameter_20file_436',['Exporting a template parameter file',['https://docs.opencv.org/4.2.0/df/dc0/tutorial_qds_export_parameters.html',1,'']]], + ['exports_2ehpp_437',['exports.hpp',['https://docs.opencv.org/4.2.0/da/dfe/exports_8hpp.html',1,'']]], + ['exposure_20compensation_438',['Exposure Compensation',['https://docs.opencv.org/4.2.0/dd/dff/group__stitching__exposure.html',1,'']]], + ['exposure_5fcompensate_2ehpp_439',['exposure_compensate.hpp',['https://docs.opencv.org/4.2.0/df/d70/exposure__compensate_8hpp.html',1,'']]], + ['exposurecompensator_440',['ExposureCompensator',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html',1,'cv::detail::ExposureCompensator'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#abd2cbffa1c8be33a5740bc7f3f20d037',1,'cv::detail::ExposureCompensator::ExposureCompensator()']]], + ['exposurecompensator_441',['exposureCompensator',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#afc646488ee47f87c743d3ab1e3832b48',1,'cv::Stitcher::exposureCompensator()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ab065fe029bb9b499c4d86c80741d0a2d',1,'cv::Stitcher::exposureCompensator() const']]], + ['expr_442',['EXPR',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba84ed741d208c2de3eaa9658ce1554379',1,'cv::_InputArray']]], + ['expr_443',['Expr',['https://docs.opencv.org/4.2.0/de/dfb/structcv_1_1cudev_1_1Expr.html',1,'cv::cudev']]], + ['expr_2ehpp_444',['expr.hpp',['https://docs.opencv.org/4.2.0/d8/d01/expr_8hpp.html',1,'']]], + ['expression_20templates_20in_20eigen_445',['Expression templates in Eigen',['https://eigen.tuxfamily.org/dox/TopicEigenExpressionTemplates.html',1,'']]], + ['expression_20type_446',['Adding a new expression type',['https://eigen.tuxfamily.org/dox/TopicNewExpressionType.html',1,'']]], + ['expressions_447',['Regular Expressions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html',1,'']]], + ['expressions_448',['expressions',['https://eigen.tuxfamily.org/dox/TopicCustomizing_NullaryExpr.html',1,'Matrix manipulation via nullary-expressions'],['https://eigen.tuxfamily.org/dox/TopicWritingEfficientProductExpression.html',1,'Writing efficient matrix product expressions']]], + ['ext_2falgorithm_449',['ext/algorithm',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16577.html',1,'']]], + ['ext_2falloc_5ftraits_2eh_450',['ext/alloc_traits.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16595.html',1,'']]], + ['ext_2fcmath_451',['ext/cmath',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16637.html',1,'']]], + ['ext_2ffunctional_452',['ext/functional',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a16937.html',1,'']]], + ['ext_2fiterator_453',['ext/iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17030.html',1,'']]], + ['ext_2fmemory_454',['ext/memory',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17081.html',1,'']]], + ['ext_2fnumeric_455',['ext/numeric',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17120.html',1,'']]], + ['ext_2frandom_2etcc_456',['ext/random.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a17177.html',1,'']]], + ['extc_2b_2b_2eh_457',['extc++.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00692.html',1,'']]], + ['extend_458',['extend',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a0ca284f3375f68b9e9aef558cd5bcd37',1,'Eigen::AlignedBox::extend(const AlignedBox &b)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ac252032292dcf60984191e4dd26f0955',1,'Eigen::AlignedBox::extend(const MatrixBase< Derived > &p)']]], + ['extended_459',['extended',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a634659515f412d8659bd449f8cdb6abf',1,'cv::cuda::SURF_CUDA::extended'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#af6c55a7ee994437667dd9b8b5a0580e0',1,'std::regex_constants::extended']]], + ['extended_20image_20processing_460',['Extended Image Processing',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html',1,'']]], + ['extended_20object_20detection_461',['Extended object detection',['https://docs.opencv.org/4.2.0/d4/d54/group__xobjdetect.html',1,'']]], + ['extendedkalmanfilter_462',['ExtendedKalmanFilter',['../classfilters_1_1ExtendedKalmanFilter.html',1,'filters::ExtendedKalmanFilter< stateDim, inputDim, outputDim, processNoiseDim, outputNoiseDim >'],['../classfilters_1_1ExtendedKalmanFilter.html#afca45e49eb1884f7e801bfea0a015f51',1,'filters::ExtendedKalmanFilter::ExtendedKalmanFilter()']]], + ['extending_20customizing_20eigen_463',['Extending/Customizing Eigen',['https://eigen.tuxfamily.org/dox/UserManual_CustomizingEigen.html',1,'']]], + ['extending_20matrixbase_20and_20other_20classes_464',['Extending MatrixBase (and other classes)',['https://eigen.tuxfamily.org/dox/TopicCustomizing_Plugins.html',1,'']]], + ['extensions_465',['Extensions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01467.html',1,'']]], + ['extensions_466',['extensions',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a963606957c52e6ca0b58de3f63afa309',1,'cv::ocl::Device']]], + ['extent_467',['extent',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a03515.html',1,'std']]], + ['exteriordistance_468',['exteriorDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#afb3b43bab1d84a95e7a515ca854cda70',1,'Eigen::AlignedBox::exteriorDistance(const AlignedBox &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a3915f625f0e57029ea27ace34aff29b2',1,'Eigen::AlignedBox::exteriorDistance(const MatrixBase< Derived > &p) const']]], + ['external_20libraries_20plugins_469',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], + ['external_5fload_5faccess_470',['external_load_access',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11163.html#afd8e1e7947fd32043e5a161234d6bb8cabc495279215d973cef60eeedf09f5a70',1,'__gnu_pbds::cc_hash_max_collision_check_resize_trigger::external_load_access'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11159.html#a05e423b5b9d07f35207c370d62f499caa8dad02122f698bdbd58666bcbc3fdf62',1,'__gnu_pbds::hash_load_check_resize_trigger::external_load_access']]], + ['extobject_471',['ExtObject',['https://docs.opencv.org/4.2.0/d1/dda/structcv_1_1DetectionBasedTracker_1_1ExtObject.html',1,'cv::DetectionBasedTracker::ExtObject'],['https://docs.opencv.org/4.2.0/d1/dda/structcv_1_1DetectionBasedTracker_1_1ExtObject.html#af8b8156ac58ff52667da607466c1e018',1,'cv::DetectionBasedTracker::ExtObject::ExtObject()']]], + ['extptr_5fallocator_2eh_472',['extptr_allocator.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01052.html',1,'']]], + ['extra_202d_20features_20framework_473',['Extra 2D Features Framework',['https://docs.opencv.org/4.2.0/d1/db4/group__xfeatures2d.html',1,'']]], + ['extract_474',['extract',['https://docs.opencv.org/4.2.0/d7/d8d/classcv_1_1cnn__3dobj_1_1descriptorExtractor.html#a99358bae501ac83551a2abd0d2a370b4',1,'cv::cnn_3dobj::descriptorExtractor']]], + ['extract_20horizontal_20and_20vertical_20lines_20by_20using_20morphological_20operations_475',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], + ['extract_5fmat_476',['extract_mat',['https://docs.opencv.org/4.2.0/d6/d84/namespacecv_1_1quality_1_1quality__utils.html#ae3019e362fe2aab8d86e7bca8c8064e4',1,'cv::quality::quality_utils']]], + ['extract_5fthreshold_477',['extract_threshold',['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#ad5307fc9b814b8705f058faf89c22186',1,'cv::linemod::DepthNormal']]], + ['extractchannel_478',['extractChannel',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gacc6158574aa1f0281878c955bcf35642',1,'cv::extractChannel()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gacc6158574aa1f0281878c955bcf35642',1,'extractChannel(InputArray src, OutputArray dst, int coi)(Global Namespace)']]], + ['extracted_20from_20an_20image_479',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], + ['extraction_480',['extraction',['https://docs.opencv.org/4.2.0/dc/da7/classcv_1_1TrackerFeatureSet.html#aac55db0d383a61e70f4d06639948c40d',1,'cv::TrackerFeatureSet']]], + ['extraction_20using_20grabcut_20algorithm_481',['Extraction using GrabCut Algorithm',['https://docs.opencv.org/4.2.0/dd/dfc/tutorial_js_grabcut.html',1,'Foreground Extraction using GrabCut Algorithm'],['https://docs.opencv.org/4.2.0/d8/d83/tutorial_py_grabcut.html',1,'Interactive Foreground Extraction using GrabCut Algorithm']]], + ['extractselected_482',['extractSelected',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a534412a37c6f3f12d2356c0a7aeb040c',1,'cv::TrackerFeatureHAAR']]], + ['extractsimplefeatures_483',['extractSimpleFeatures',['https://docs.opencv.org/4.2.0/d4/d3b/classcv_1_1xphoto_1_1LearningBasedWB.html#aeeaca052262a01d0feed6312ccb9a76e',1,'cv::xphoto::LearningBasedWB']]], + ['extracttemplate_484',['extractTemplate',['https://docs.opencv.org/4.2.0/d7/d6f/classcv_1_1linemod_1_1QuantizedPyramid.html#a258730f1ea19c812d092eaff325b8457',1,'cv::linemod::QuantizedPyramid']]], + ['extrapolation_2ehpp_485',['extrapolation.hpp',['https://docs.opencv.org/4.2.0/d4/d28/extrapolation_8hpp.html',1,'']]], + ['extreme_5fvalue_5fdistribution_486',['extreme_value_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html',1,'std']]], + ['extrinsicparams_487',['extrinsicParams',['../structcam_1_1CameraConfig.html#a33cbe320899f227ff3f3e631a2bbd696',1,'cam::CameraConfig']]], + ['eye_488',['eye',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a2cf9b9acde7a9852542bbc20ef851ed2',1,'cv::Mat::eye(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aab87b56e1dc370ffe4afb735b6a1e5c9',1,'cv::Mat::eye(Size size, int type)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a992daefd1a256fbd40423a2cf77f42a1',1,'cv::Mat_::eye(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4b16819512990144b9f0d0b76758f491',1,'cv::Mat_::eye(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a992daefd1a256fbd40423a2cf77f42a1',1,'Mat_< double >::eye(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4b16819512990144b9f0d0b76758f491',1,'Mat_< double >::eye(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a992daefd1a256fbd40423a2cf77f42a1',1,'Mat_< float >::eye(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4b16819512990144b9f0d0b76758f491',1,'Mat_< float >::eye(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a992daefd1a256fbd40423a2cf77f42a1',1,'Mat_< uchar >::eye(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4b16819512990144b9f0d0b76758f491',1,'Mat_< uchar >::eye(Size size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a992daefd1a256fbd40423a2cf77f42a1',1,'Mat_< unsigned char >::eye(int rows, int cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4b16819512990144b9f0d0b76758f491',1,'Mat_< unsigned char >::eye(Size size)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'cv::Matx::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< _Tp, cn, 1 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, 1, 3 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, 2, 2 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, 2, 3 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, 3, 3 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, 3, 4 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, 4, 4 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< double, cn, 1 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< float, 2, 3 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< float, 3, 3 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< float, cn, 1 >::eye()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8633b16f0c8296bcee707815abe18b0e',1,'Matx< float_type, 4, 4 >::eye()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a479e07ad4829b35b83f2aae7231d0ec6',1,'cv::UMat::eye(int rows, int cols, int type)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a79a713e4c931aae8a8b13ec3c62326b9',1,'cv::UMat::eye(Size size, int type)']]] ]; diff --git a/search/all_f.js b/search/all_f.js index 84848311..3db76f5e 100644 --- a/search/all_f.js +++ b/search/all_f.js @@ -1,7 +1,7 @@ var searchData= [ - ['f_0',['f',['https://docs.opencv.org/4.2.0/df/da3/structcv_1_1linemod_1_1QuantizedPyramid_1_1Candidate.html#a4b7d970bc8d2999b886bfecd21dcdeb4',1,'cv::linemod::QuantizedPyramid::Candidate::f'],['https://docs.opencv.org/4.2.0/d9/df3/unionCv32suf.html#a89f398e11fc2af45eb6553e8b0a0fd18',1,'Cv32suf::f'],['https://docs.opencv.org/4.2.0/de/d55/unionCv64suf.html#a963f2cd7c89ac7177d0c72d41afcf6f9',1,'Cv64suf::f']]], - ['f_1',['F',['https://docs.opencv.org/4.2.0/df/d95/classcv_1_1detail_1_1GCompoundKernel.html#ab6a98f0b9046b9dfe060203c360d4da8',1,'cv::detail::GCompoundKernel::F'],['https://docs.opencv.org/4.2.0/df/d27/classcv_1_1GCPUKernel.html#a0c7f3eb2efaa36553559eaf4fd294cf0',1,'cv::GCPUKernel::F'],['https://docs.opencv.org/4.2.0/d0/dc4/classcv_1_1GFluidKernel.html#aa90564111600d3a008f62f19ccef689a',1,'cv::GFluidKernel::F'],['https://docs.opencv.org/4.2.0/d5/d65/classcv_1_1GOCLKernel.html#aff00699e540127c7d92fb352164257ab',1,'cv::GOCLKernel::F'],['https://docs.opencv.org/4.2.0/df/db7/classcv_1_1GPlaidMLKernel.html#a8f206ecd311e4461f5edfe17e3692684',1,'cv::GPlaidMLKernel::F'],['https://docs.opencv.org/4.2.0/dd/db9/structcv_1_1GTransform.html#a13e5a25158bdea74c7ed03b53df23237',1,'cv::GTransform::F']]], + ['f_0',['F',['https://docs.opencv.org/4.2.0/df/d95/classcv_1_1detail_1_1GCompoundKernel.html#ab6a98f0b9046b9dfe060203c360d4da8',1,'cv::detail::GCompoundKernel::F'],['https://docs.opencv.org/4.2.0/df/d27/classcv_1_1GCPUKernel.html#a0c7f3eb2efaa36553559eaf4fd294cf0',1,'cv::GCPUKernel::F'],['https://docs.opencv.org/4.2.0/d0/dc4/classcv_1_1GFluidKernel.html#aa90564111600d3a008f62f19ccef689a',1,'cv::GFluidKernel::F'],['https://docs.opencv.org/4.2.0/d5/d65/classcv_1_1GOCLKernel.html#aff00699e540127c7d92fb352164257ab',1,'cv::GOCLKernel::F'],['https://docs.opencv.org/4.2.0/df/db7/classcv_1_1GPlaidMLKernel.html#a8f206ecd311e4461f5edfe17e3692684',1,'cv::GPlaidMLKernel::F'],['https://docs.opencv.org/4.2.0/dd/db9/structcv_1_1GTransform.html#a13e5a25158bdea74c7ed03b53df23237',1,'cv::GTransform::F']]], + ['f_1',['f',['https://docs.opencv.org/4.2.0/df/da3/structcv_1_1linemod_1_1QuantizedPyramid_1_1Candidate.html#a4b7d970bc8d2999b886bfecd21dcdeb4',1,'cv::linemod::QuantizedPyramid::Candidate::f'],['https://docs.opencv.org/4.2.0/d9/df3/unionCv32suf.html#a89f398e11fc2af45eb6553e8b0a0fd18',1,'Cv32suf::f'],['https://docs.opencv.org/4.2.0/de/d55/unionCv64suf.html#a963f2cd7c89ac7177d0c72d41afcf6f9',1,'Cv64suf::f']]], ['f_20transform_2',['F transform',['https://docs.opencv.org/4.2.0/d3/d1d/tutorial_fuzzy_filtering.html',1,'Filtering using F-transform'],['https://docs.opencv.org/4.2.0/d3/db8/tutorial_fuzzy_inpainting.html',1,'Inpainting using F-transform']]], ['f_20transform_20theory_3',['F-transform theory',['https://docs.opencv.org/4.2.0/db/daf/tutorial_fuzzy_theory.html',1,'']]], ['f0_20transform_20support_4',['Math with F0-transform support',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html',1,'']]], @@ -100,543 +100,530 @@ var searchData= ['featherblender_97',['FeatherBlender',['https://docs.opencv.org/4.2.0/d4/d69/classcv_1_1detail_1_1FeatherBlender.html',1,'cv::detail::FeatherBlender'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga8af0665c8cb305e32a208a873addece9',1,'cv::detail::FeatherBlender::FeatherBlender()'],['https://docs.opencv.org/4.2.0/d9/d46/group__stitching__blend.html#ga8af0665c8cb305e32a208a873addece9',1,'FeatherBlender()(Global Namespace)']]], ['feats_5fm_98',['feats_m',['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a13d3dcf93477b7a0efc74a4bfcc185c3',1,'cv::face::FacemarkLBF::Params']]], ['featsize_99',['featSize',['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#a855fc00ac3b64b695102f06ab399f6ca',1,'cv::CvFeatureParams']]], - ['feature_100',['Feature',['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html',1,'cv::CvHOGEvaluator::Feature'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html',1,'cv::CvLBPEvaluator::Feature'],['https://docs.opencv.org/4.2.0/d9/db9/structcv_1_1linemod_1_1Feature.html',1,'cv::linemod::Feature']]], + ['feature_100',['Feature',['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html',1,'cv::CvHOGEvaluator::Feature'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html',1,'cv::CvLBPEvaluator::Feature'],['https://docs.opencv.org/4.2.0/d9/db9/structcv_1_1linemod_1_1Feature.html',1,'cv::linemod::Feature'],['https://docs.opencv.org/4.2.0/d9/db9/structcv_1_1linemod_1_1Feature.html#ad3fcf6e51cf0d53d8119d9d290a0a662',1,'cv::linemod::Feature::Feature()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gac46f8de81ef5948eeac596c735e80371',1,'cv::linemod::Feature::Feature(int x, int y, int label)'],['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#ab7b48aa3ec4a72a9ffb075899eb3b780',1,'cv::CvHOGEvaluator::Feature::Feature()'],['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#ac08eeaf6c9fa42fe898c170e92fedce6',1,'cv::CvHOGEvaluator::Feature::Feature(int offset, int x, int y, int cellW, int cellH)'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html#a3b131b6ee60e69ab59d6a9fd77721081',1,'cv::CvLBPEvaluator::Feature::Feature()'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html#ad5b41543d7a270668148cf01416644ab',1,'cv::CvLBPEvaluator::Feature::Feature(int offset, int x, int y, int _block_w, int _block_h)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gac46f8de81ef5948eeac596c735e80371',1,'Feature()(Global Namespace)']]], ['feature_101',['feature',['https://docs.opencv.org/4.2.0/d1/dfd/structcv_1_1optflow_1_1GPCPatchDescriptor.html#ac889e5305e19e8d786e1093e521d9ec0',1,'cv::optflow::GPCPatchDescriptor']]], - ['feature_102',['Feature',['https://docs.opencv.org/4.2.0/d9/db9/structcv_1_1linemod_1_1Feature.html#ad3fcf6e51cf0d53d8119d9d290a0a662',1,'cv::linemod::Feature::Feature()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gac46f8de81ef5948eeac596c735e80371',1,'cv::linemod::Feature::Feature(int x, int y, int label)'],['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#ab7b48aa3ec4a72a9ffb075899eb3b780',1,'cv::CvHOGEvaluator::Feature::Feature()'],['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#ac08eeaf6c9fa42fe898c170e92fedce6',1,'cv::CvHOGEvaluator::Feature::Feature(int offset, int x, int y, int cellW, int cellH)'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html#a3b131b6ee60e69ab59d6a9fd77721081',1,'cv::CvLBPEvaluator::Feature::Feature()'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html#ad5b41543d7a270668148cf01416644ab',1,'cv::CvLBPEvaluator::Feature::Feature(int offset, int x, int y, int _block_w, int _block_h)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gac46f8de81ef5948eeac596c735e80371',1,'Feature(int x, int y, int label)(Global Namespace)']]], - ['feature_20description_103',['Feature Description',['https://docs.opencv.org/4.2.0/d5/dde/tutorial_feature_description.html',1,'']]], - ['feature_20detection_104',['Feature Detection',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/d7/d66/tutorial_feature_detection.html',1,'Feature Detection']]], - ['feature_20detection_20and_20description_105',['Feature Detection and Description',['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/db/d27/tutorial_py_table_of_contents_feature2d.html',1,'Feature Detection and Description']]], - ['feature_20matching_106',['Feature Matching',['https://docs.opencv.org/4.2.0/dc/dc3/tutorial_py_matcher.html',1,'']]], - ['feature_20matching_20homography_20to_20find_20objects_107',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], - ['feature_20matching_20with_20flann_108',['Feature Matching with FLANN',['https://docs.opencv.org/4.2.0/d5/d6f/tutorial_feature_flann_matcher.html',1,'']]], - ['feature_20selection_20for_20efficient_20image_20segmentation_109',['Hierarchical Feature Selection for Efficient Image Segmentation',['https://docs.opencv.org/4.2.0/dc/d29/group__hfs.html',1,'']]], - ['feature_20transform_110',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], - ['feature_2ehpp_111',['feature.hpp',['https://docs.opencv.org/4.2.0/d4/d35/feature_8hpp.html',1,'']]], - ['feature2d_112',['Feature2D',['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html',1,'cv']]], - ['feature2d_20module_113',['2D Features framework (feature2d module)',['https://docs.opencv.org/4.2.0/d9/d97/tutorial_table_of_content_features2d.html',1,'']]], - ['feature2dasync_114',['Feature2DAsync',['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1cuda_1_1Feature2DAsync.html',1,'cv::cuda']]], - ['feature_5fdescription_2emarkdown_115',['feature_description.markdown',['https://docs.opencv.org/4.2.0/dc/d9f/feature__description_8markdown.html',1,'']]], - ['feature_5fdetection_2emarkdown_116',['feature_detection.markdown',['https://docs.opencv.org/4.2.0/d7/db5/feature__detection_8markdown.html',1,'']]], - ['feature_5fflann_5fmatcher_2emarkdown_117',['feature_flann_matcher.markdown',['https://docs.opencv.org/4.2.0/d9/d22/feature__flann__matcher_8markdown.html',1,'']]], - ['feature_5fhomography_2emarkdown_118',['feature_homography.markdown',['https://docs.opencv.org/4.2.0/d3/d0b/feature__homography_8markdown.html',1,'']]], - ['feature_5fset_5fcompute_5f10_119',['FEATURE_SET_COMPUTE_10',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ab34c101b8be1bfbf64fe53db6277639d',1,'cv::cuda::FEATURE_SET_COMPUTE_10'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ab34c101b8be1bfbf64fe53db6277639d',1,'FEATURE_SET_COMPUTE_10(Global Namespace)']]], - ['feature_5fset_5fcompute_5f11_120',['FEATURE_SET_COMPUTE_11',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a82461455d1a5663b49d55c4b21c6ff52',1,'cv::cuda::FEATURE_SET_COMPUTE_11'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a82461455d1a5663b49d55c4b21c6ff52',1,'FEATURE_SET_COMPUTE_11(Global Namespace)']]], - ['feature_5fset_5fcompute_5f12_121',['FEATURE_SET_COMPUTE_12',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0abe959647501a9c973592060723fe9d16',1,'cv::cuda::FEATURE_SET_COMPUTE_12'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0abe959647501a9c973592060723fe9d16',1,'FEATURE_SET_COMPUTE_12(Global Namespace)']]], - ['feature_5fset_5fcompute_5f13_122',['FEATURE_SET_COMPUTE_13',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ae1996d5cc9efd9d0db1edb987a6b88b0',1,'cv::cuda::FEATURE_SET_COMPUTE_13'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ae1996d5cc9efd9d0db1edb987a6b88b0',1,'FEATURE_SET_COMPUTE_13(Global Namespace)']]], - ['feature_5fset_5fcompute_5f20_123',['FEATURE_SET_COMPUTE_20',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ac3b86a55893548ec28d6360b38ef78cd',1,'cv::cuda::FEATURE_SET_COMPUTE_20'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ac3b86a55893548ec28d6360b38ef78cd',1,'FEATURE_SET_COMPUTE_20(Global Namespace)']]], - ['feature_5fset_5fcompute_5f21_124',['FEATURE_SET_COMPUTE_21',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ac46cbea580480b80f48f9a843b1fca98',1,'cv::cuda::FEATURE_SET_COMPUTE_21'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ac46cbea580480b80f48f9a843b1fca98',1,'FEATURE_SET_COMPUTE_21(Global Namespace)']]], - ['feature_5fset_5fcompute_5f30_125',['FEATURE_SET_COMPUTE_30',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0aeb9eaa4b4a1be83d87212c4afad9bebb',1,'cv::cuda::FEATURE_SET_COMPUTE_30'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0aeb9eaa4b4a1be83d87212c4afad9bebb',1,'FEATURE_SET_COMPUTE_30(Global Namespace)']]], - ['feature_5fset_5fcompute_5f32_126',['FEATURE_SET_COMPUTE_32',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a965876faa336b34a95b781129915766d',1,'cv::cuda::FEATURE_SET_COMPUTE_32'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a965876faa336b34a95b781129915766d',1,'FEATURE_SET_COMPUTE_32(Global Namespace)']]], - ['feature_5fset_5fcompute_5f35_127',['FEATURE_SET_COMPUTE_35',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0acb28f583b1a1e680da03ef1363e96301',1,'cv::cuda::FEATURE_SET_COMPUTE_35'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0acb28f583b1a1e680da03ef1363e96301',1,'FEATURE_SET_COMPUTE_35(Global Namespace)']]], - ['feature_5fset_5fcompute_5f50_128',['FEATURE_SET_COMPUTE_50',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a4e7aa099ce8d9f1b4c26cb9755a17d11',1,'cv::cuda::FEATURE_SET_COMPUTE_50'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a4e7aa099ce8d9f1b4c26cb9755a17d11',1,'FEATURE_SET_COMPUTE_50(Global Namespace)']]], - ['feature_5fsize_129',['FEATURE_SIZE',['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#af613a7b713366233955c179c36c11765',1,'cv::cuda::FastFeatureDetector']]], - ['featuredetector_130',['FeatureDetector',['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#ga15e1361bda978d83a2bea629b32dfd3c',1,'cv::FeatureDetector'],['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#ga15e1361bda978d83a2bea629b32dfd3c',1,'FeatureDetector(Global Namespace)']]], - ['featurehaar_131',['FeatureHaar',['https://docs.opencv.org/4.2.0/d3/d52/classcv_1_1CvHaarEvaluator_1_1FeatureHaar.html',1,'cv::CvHaarEvaluator::FeatureHaar'],['https://docs.opencv.org/4.2.0/d3/d52/classcv_1_1CvHaarEvaluator_1_1FeatureHaar.html#aaafa166f32d73efd668d4831e113e58d',1,'cv::CvHaarEvaluator::FeatureHaar::FeatureHaar()']]], - ['featureparams_132',['featureParams',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a124c98256e32e583049b9baf151b5ce3',1,'cv::CvFeatureEvaluator']]], - ['features_133',['Features',['https://docs.opencv.org/4.2.0/dc/d7d/tutorial_py_brief.html',1,'BRIEF (Binary Robust Independent Elementary Features)'],['https://docs.opencv.org/4.2.0/dd/d49/tutorial_py_contour_features.html',1,'Contour Features'],['https://docs.opencv.org/4.2.0/dc/dcf/tutorial_js_contour_features.html',1,'Contour Features']]], - ['features_134',['features',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a1533d1cad65832fad3621fb5226f03db',1,'cv::CvHaarEvaluator::features'],['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#a1c425fbb32bb6b27bf0b9fbda5383738',1,'cv::CvHOGEvaluator::features'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#acc44beb866238a3a6fa3111cec29076b',1,'cv::CvLBPEvaluator::features'],['https://docs.opencv.org/4.2.0/d2/dc7/structcv_1_1linemod_1_1Template.html#a72795393e691fccda8906544de0e8142',1,'cv::linemod::Template::features']]], - ['features_135',['Features',['https://docs.opencv.org/4.2.0/df/d04/tutorial_js_table_of_contents_gui.html',1,'GUI Features'],['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'Introduction to SURF (Speeded-Up Robust Features)'],['https://docs.opencv.org/4.2.0/df/d54/tutorial_py_features_meaning.html',1,'Understanding Features']]], - ['features_20algorithms_136',['Features Algorithms',['https://docs.opencv.org/4.2.0/d7/d7a/group__xfeatures2d__experiment.html',1,'Experimental 2D Features Algorithms'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html',1,'Non-free 2D Features Algorithms']]], - ['features_20finding_20and_20images_20matching_137',['Features Finding and Images Matching',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'']]], - ['features_20framework_138',['Features Framework',['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html',1,'2D Features Framework'],['https://docs.opencv.org/4.2.0/d1/db4/group__xfeatures2d.html',1,'Extra 2D Features Framework']]], - ['features_20framework_20feature2d_20module_139',['2D Features framework (feature2d module)',['https://docs.opencv.org/4.2.0/d9/d97/tutorial_table_of_content_features2d.html',1,'']]], - ['features_20in_20opencv_140',['Gui Features in OpenCV',['https://docs.opencv.org/4.2.0/dc/d4d/tutorial_py_table_of_contents_gui.html',1,'']]], - ['features_20matching_141',['AKAZE local features matching',['https://docs.opencv.org/4.2.0/db/d70/tutorial_akaze_matching.html',1,'']]], - ['features_20matching_20algorithm_142',['Experimental 2D Features Matching Algorithm',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html',1,'']]], - ['features_20to_20track_143',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], - ['features_20tutorial_144',['Line Features Tutorial',['https://docs.opencv.org/4.2.0/df/dfa/tutorial_line_descriptor_main.html',1,'']]], - ['features_2eh_145',['features.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00893.html',1,'']]], - ['features2d_20homography_20to_20find_20a_20known_20object_146',['Features2D + Homography to find a known object',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_feature_homography.html',1,'']]], - ['features2d_2ehpp_147',['features2d.hpp',['https://docs.opencv.org/4.2.0/d5/def/features2d_2features2d_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/d0d/features2d_8hpp.html',1,'(Global Namespace)']]], - ['features_5f_148',['features_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a3e3bcb444b3e4b4bd570653d247c8639',1,'cv::detail::BundleAdjusterBase']]], - ['featureset_149',['featureSet',['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a8def260b357961c80f25dc686274ec7f',1,'cv::Tracker']]], - ['featureset_150',['FeatureSet',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga776cf8e0301b18e19be4782754274fe0',1,'cv::cuda::FeatureSet'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga776cf8e0301b18e19be4782754274fe0',1,'FeatureSet(Global Namespace)']]], - ['featuresetnumfeatures_151',['featureSetNumFeatures',['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html#a93b179a63208f2f6849595ffd4b901f1',1,'cv::TrackerMIL::Params::featureSetNumFeatures'],['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#a22848e20713337aaa9ae7dc6dfd8b96a',1,'cv::TrackerBoosting::Params::featureSetNumFeatures']]], - ['featuresfinder_152',['featuresFinder',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad92b06472f22df6c9e25869fc58e9ceb',1,'cv::Stitcher::featuresFinder()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#af96ea17da5a882e990c0b77e43850179',1,'cv::Stitcher::featuresFinder() const']]], - ['featuresmatcher_153',['FeaturesMatcher',['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html',1,'cv::detail::FeaturesMatcher'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a24ba277980b3f2d220f2a0b01c527569',1,'cv::detail::FeaturesMatcher::FeaturesMatcher()']]], - ['featuresmatcher_154',['featuresMatcher',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a426a576f1e2c12d9d5437a86625564c0',1,'cv::Stitcher::featuresMatcher()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#adf4593da8d34466283ef0cdd21fff3e7',1,'cv::Stitcher::featuresMatcher() const']]], - ['featuretype_155',['FeatureType',['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#aebd27314d1f03cb2b770888fb9d45b18',1,'cv::CvFeatureParams']]], - ['fedora_156',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], - ['feed_157',['feed',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#a64837308bcf4e414a6219beff6cbe37a',1,'cv::detail::Blender::feed()'],['https://docs.opencv.org/4.2.0/d3/dab/classcv_1_1detail_1_1BlocksChannelsCompensator.html#a98fd8e7b3c10baebdcae600050e7ac6c',1,'cv::detail::BlocksChannelsCompensator::feed()'],['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a179fe61406583ec538c4569b57d062e2',1,'cv::detail::BlocksCompensator::feed()'],['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html#adfebf2569b39ef2599bc2fe98ac80a59',1,'cv::detail::BlocksGainCompensator::feed()'],['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html#adbe4fab11316d30158a89a5602a10e4f',1,'cv::detail::ChannelsCompensator::feed()'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ae6b0cc69a7bc53818ddea53eddb6bdba',1,'cv::detail::ExposureCompensator::feed(const std::vector< Point > &corners, const std::vector< UMat > &images, const std::vector< UMat > &masks)'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#a469ee24e889b645c2a0648658b356043',1,'cv::detail::ExposureCompensator::feed(const std::vector< Point > &corners, const std::vector< UMat > &images, const std::vector< std::pair< UMat, uchar > > &masks)=0'],['https://docs.opencv.org/4.2.0/d4/d69/classcv_1_1detail_1_1FeatherBlender.html#a2524f767f9651491a7f81bd363e63e39',1,'cv::detail::FeatherBlender::feed()'],['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#a82008c64988de865ef4ae34491ece331',1,'cv::detail::GainCompensator::feed()'],['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html#a71c5311ae8432eaf69bae7d97ca1f3fe',1,'cv::detail::MultiBandBlender::feed()'],['https://docs.opencv.org/4.2.0/d2/dc1/classcv_1_1detail_1_1NoExposureCompensator.html#ade1d7db11e1695e8ba2a5359e7102e64',1,'cv::detail::NoExposureCompensator::feed()'],['../classutil_1_1Watchdog.html#a8229de63013993a4056291d5360ddc78',1,'util::Watchdog::feed()']]], - ['female_158',['female',['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html#gga3bdb11e4d5333d49ecab1e789fcce58ea428e94219615ce49fda832cf97a382fb',1,'cv::datasets::female'],['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html#gga3bdb11e4d5333d49ecab1e789fcce58ea428e94219615ce49fda832cf97a382fb',1,'female(Global Namespace)']]], - ['fenv_2eh_159',['fenv.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00005.html',1,'']]], - ['ff_160',['ff',['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a127f8256b9e7db44396137e4fc663f0a',1,'cv::gapi::wip::draw::Text']]], - ['fgdparams_161',['FGDParams',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html',1,'cv::cuda::FGDParams'],['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#a29e0c8c9f237e3da48ea9dda2f44505f',1,'cv::cuda::FGDParams::FGDParams()']]], - ['fh_162',['fh',['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#a6506f033f7f7696b9b1c8b9c707a53cd',1,'cv::gapi::wip::draw::FText']]], - ['fht_5fadd_163',['FHT_ADD',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a998fc1e1cca9a365651dd9917205f991a359b7ee9f22eb20107d8600fb92e09e8',1,'cv::ximgproc']]], - ['fht_5fave_164',['FHT_AVE',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a998fc1e1cca9a365651dd9917205f991aa4f4c96ce42b4e255925a00f018db333',1,'cv::ximgproc']]], - ['fht_5fmax_165',['FHT_MAX',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a998fc1e1cca9a365651dd9917205f991ac543a6f391969565a70ee23f975a8d75',1,'cv::ximgproc']]], - ['fht_5fmin_166',['FHT_MIN',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a998fc1e1cca9a365651dd9917205f991ac775165fcc9202a066e85aa58db24e5a',1,'cv::ximgproc']]], - ['fiducial_5fscore_167',['fiducial_score',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#a63efee372a9c5c42cdfc67f092ccbbba',1,'cv::datasets::FR_adienceObj']]], - ['fiducial_5fyaw_5fangle_168',['fiducial_yaw_angle',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#a72ea703d36fa29d577cc97d00139e349',1,'cv::datasets::FR_adienceObj']]], - ['file_169',['file',['https://docs.opencv.org/4.2.0/df/dc0/tutorial_qds_export_parameters.html',1,'Exporting a template parameter file'],['https://docs.opencv.org/4.2.0/d4/dd9/structcvv_1_1impl_1_1CallMetaData.html#acedbc755e15b5a0d955cbe58108537f4',1,'cvv::impl::CallMetaData::file'],['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#afef67d957832b1e20e24208a1da57379',1,'cv::Exception::file'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#ad6abbe04f3851c05497276f37eb2c154',1,'__gnu_cxx::stdio_filebuf::file()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10671.html#ad299b6d238aa256ffb021a3d4cd544da',1,'__gnu_cxx::stdio_sync_filebuf::file()']]], - ['file_20input_20and_20output_20using_20xml_20and_20yaml_20files_170',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], - ['file_20reading_20and_20writing_171',['Image file reading and writing',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html',1,'']]], - ['file_5finput_5foutput_5fwith_5fxml_5fyml_2emarkdown_172',['file_input_output_with_xml_yml.markdown',['https://docs.opencv.org/4.2.0/db/db0/file__input__output__with__xml__yml_8markdown.html',1,'']]], - ['filebuf_173',['filebuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gaa33740c61965014b7bc0f229f73f65ad',1,'std::filebuf'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gaa33740c61965014b7bc0f229f73f65ad',1,'filebuf(Global Namespace)']]], - ['filename_174',['filename',['https://docs.opencv.org/4.2.0/d0/db6/structcv_1_1datasets_1_1OR__pascalObj.html#a43281c86747b2a116960953662ebd93f',1,'cv::datasets::OR_pascalObj::filename'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1datasets_1_1PD__inriaObj.html#a376d963836cb12a17767969d9b7455b0',1,'cv::datasets::PD_inriaObj::filename']]], - ['filename_175',['fileName',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#add0020a627fead72259285e837069056',1,'cv::datasets::HPE_humanevaObj::fileName'],['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1datasets_1_1TR__icdarObj.html#a9e189665fb29ff90c2be90643a9b19e9',1,'cv::datasets::TR_icdarObj::fileName'],['https://docs.opencv.org/4.2.0/d3/dc5/structcv_1_1datasets_1_1TR__svtObj.html#a303cc5b4a391a455d9e93a7a7da9a869',1,'cv::datasets::TR_svtObj::fileName']]], - ['filenameorid_176',['filenameOrID',['../structcam_1_1CameraConfig.html#ab308ad40c78d14a529c86c0365ec9898',1,'cam::CameraConfig']]], - ['filenode_177',['FileNode',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html',1,'cv::FileNode'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a062a89a78d3cab1e7949b3d0fd3d60ee',1,'cv::FileNode::FileNode()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#adb447cc64f8461cbfaea20d203b8fb4e',1,'cv::FileNode::FileNode(const FileStorage *fs, size_t blockIdx, size_t ofs)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a3f12e82f34ff7f1be73eea1270a35d50',1,'cv::FileNode::FileNode(const FileNode &node)']]], - ['filenodeiterator_178',['FileNodeIterator',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html',1,'cv::FileNodeIterator'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#aa048945804bcbd368db919ce3ef775e5',1,'cv::FileNodeIterator::FileNodeIterator()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ac4cf40e6c8b2d85e956dd35d2fa82382',1,'cv::FileNodeIterator::FileNodeIterator(const FileNode &node, bool seekEnd)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a0e43453413ee5ee52b51c4061733aeb1',1,'cv::FileNodeIterator::FileNodeIterator(const FileNodeIterator &it)']]], - ['files_179',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], - ['files_20with_20gdal_180',['Reading Geospatial Raster files with GDAL',['https://docs.opencv.org/4.2.0/d7/d73/tutorial_raster_io_gdal.html',1,'']]], - ['filestorage_181',['FileStorage',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html',1,'cv::FileStorage'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a29bcb12ede10d87a0fcbf89a88b092af',1,'cv::FileStorage::FileStorage()'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a587b4f5793a894fbe245e95cb30d6bc7',1,'cv::FileStorage::FileStorage(const String &filename, int flags, const String &encoding=String())']]], - ['filesystem_182',['filesystem',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01010.html',1,'']]], - ['filesystem_20ts_183',['Filesystem TS',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html',1,'']]], - ['filesystem_2ehpp_184',['filesystem.hpp',['https://docs.opencv.org/4.2.0/d1/d85/filesystem_8hpp.html',1,'']]], - ['filesystem_2eprivate_2ehpp_185',['filesystem.private.hpp',['https://docs.opencv.org/4.2.0/d3/d48/filesystem_8private_8hpp.html',1,'']]], - ['fill_186',['fill',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#ad26f2b09d9868cf108e84c9814aa682d',1,'cv::RNG::fill()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'basic_ios< char, _Traits >::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'basic_ios< char, _Traits >::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'basic_iostream< char >::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'basic_iostream< char >::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'basic_istream< char >::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'basic_istream< char >::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'basic_istream< char, _Traits >::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'basic_istream< char, _Traits >::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'basic_ostream< char >::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'basic_ostream< char >::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'basic_ostream< char, _Traits >::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'basic_ostream< char, _Traits >::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_fstream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_fstream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_ifstream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_ifstream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_ios::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_ios::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_iostream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_iostream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_istream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_istream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_istringstream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_istringstream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_ofstream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_ofstream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_ostream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_ostream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_ostringstream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_ostringstream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_stringstream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_stringstream::fill(char_type __ch)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9be169c308801411aa24be93d30930bf',1,'Eigen::DenseBase::fill()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9be169c308801411aa24be93d30930bf',1,'DenseBase< ArrayWrapper< ExpressionType > >::fill()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9be169c308801411aa24be93d30930bf',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::fill()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9be169c308801411aa24be93d30930bf',1,'DenseBase< Solve< Decomposition, RhsType > >::fill()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#ab1086025ddef904f5fae0282de474d24',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::fill()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gab2e4bb5cc3300aaf6c0e5bdc3371bf06',1,'std::fill()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gab2e4bb5cc3300aaf6c0e5bdc3371bf06',1,'fill()(Global Namespace)']]], - ['fill_5fminimal_5fn_187',['fill_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ae12932b6ecb49293c8c68a0d5dbf8919',1,'__gnu_parallel::_Settings']]], - ['fill_5fn_188',['fill_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga0af400b776b8486401daf6ecf91bacca',1,'std::fill_n()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga0af400b776b8486401daf6ecf91bacca',1,'fill_n()(Global Namespace)']]], - ['fillconstraints_189',['fillConstraints',['https://docs.opencv.org/4.2.0/d5/d5e/classcv_1_1optflow_1_1PCAPrior.html#afbd580da9e1e1dad67a39f094bb7e0c9',1,'cv::optflow::PCAPrior']]], - ['fillconvexpoly_190',['fillConvexPoly',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga3069baf93b51565e386c8e591f8418e6',1,'cv::fillConvexPoly(InputOutputArray img, const Point *pts, int npts, const Scalar &color, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga9bb982be9d641dc51edd5e8ae3624e1f',1,'cv::fillConvexPoly(InputOutputArray img, InputArray points, const Scalar &color, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga3069baf93b51565e386c8e591f8418e6',1,'fillConvexPoly(InputOutputArray img, const Point *pts, int npts, const Scalar &color, int lineType=LINE_8, int shift=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga9bb982be9d641dc51edd5e8ae3624e1f',1,'fillConvexPoly(InputOutputArray img, InputArray points, const Scalar &color, int lineType=LINE_8, int shift=0)(Global Namespace)']]], - ['filled_191',['FILLED',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a89c5f6beef080e6df347167f85e07b9e',1,'cv::FILLED'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a89c5f6beef080e6df347167f85e07b9e',1,'FILLED(Global Namespace)']]], - ['fillfixed_192',['fillFixed',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a931f3b7eddb7c9ff104a4c05defce512',1,'cv::omnidir::internal']]], - ['fillfixedstereo_193',['fillFixedStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a877fd2f07d10492659c1835d8206d08f',1,'cv::omnidir::internal']]], - ['fillpoly_194',['fillPoly',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga8c69b68fab5f25e2223b6496aa60dad5',1,'cv::fillPoly(InputOutputArray img, const Point **pts, const int *npts, int ncontours, const Scalar &color, int lineType=LINE_8, int shift=0, Point offset=Point())'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga311160e71d37e3b795324d097cb3a7dc',1,'cv::fillPoly(InputOutputArray img, InputArrayOfArrays pts, const Scalar &color, int lineType=LINE_8, int shift=0, Point offset=Point())'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga8c69b68fab5f25e2223b6496aa60dad5',1,'fillPoly(InputOutputArray img, const Point **pts, const int *npts, int ncontours, const Scalar &color, int lineType=LINE_8, int shift=0, Point offset=Point())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga311160e71d37e3b795324d097cb3a7dc',1,'fillPoly(InputOutputArray img, InputArrayOfArrays pts, const Scalar &color, int lineType=LINE_8, int shift=0, Point offset=Point())(Global Namespace)']]], - ['filter_195',['Filter',['https://docs.opencv.org/4.2.0/dc/d2b/classcv_1_1cuda_1_1Filter.html',1,'cv::cuda']]], - ['filter_196',['filter',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a66138c103e5bc2976a2cce127a775e6a',1,'cv::ximgproc::AdaptiveManifoldFilter::filter()'],['https://docs.opencv.org/4.2.0/db/d72/classcv_1_1ximgproc_1_1DisparityFilter.html#a3dc752f1760b375f1ea12173c1f07a9e',1,'cv::ximgproc::DisparityFilter::filter()'],['https://docs.opencv.org/4.2.0/d3/d9d/classcv_1_1ximgproc_1_1DTFilter.html#a252bada5a4f25071183b4b93ab21303f',1,'cv::ximgproc::DTFilter::filter()'],['https://docs.opencv.org/4.2.0/db/d50/classcv_1_1ximgproc_1_1FastBilateralSolverFilter.html#acfa4034b01fe2503b9e0932e5f543fff',1,'cv::ximgproc::FastBilateralSolverFilter::filter()'],['https://docs.opencv.org/4.2.0/de/d13/classcv_1_1ximgproc_1_1FastGlobalSmootherFilter.html#ad27f0d7c7c20926046ed89a93f79784d',1,'cv::ximgproc::FastGlobalSmootherFilter::filter()'],['https://docs.opencv.org/4.2.0/de/d73/classcv_1_1ximgproc_1_1GuidedFilter.html#a342f5ac3131a9e4c06472c587668eb40',1,'cv::ximgproc::GuidedFilter::filter()'],['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a32b3b9f6efa4e6f8bd37695252bd50b1',1,'cv::dnn_objdetect::InferBbox::filter()'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga99c17738a69b556b18bc86e7aee1a1d9',1,'cv::ft::filter()'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga99c17738a69b556b18bc86e7aee1a1d9',1,'filter(InputArray image, InputArray kernel, OutputArray output)(Global Namespace)']]], - ['filter_197',['Filter',['https://docs.opencv.org/4.2.0/d1/dfd/tutorial_motion_deblur_filter.html',1,'Motion Deblur Filter'],['https://docs.opencv.org/4.2.0/de/d3c/tutorial_out_of_focus_deblur_filter.html',1,'Out-of-focus Deblur Filter'],['https://docs.opencv.org/4.2.0/d2/d0b/tutorial_periodic_noise_removing_filter.html',1,'Periodic Noise Removing Filter']]], - ['filter_2ehpp_198',['filter.hpp',['https://docs.opencv.org/4.2.0/d1/dd2/filter_8hpp.html',1,'']]], - ['filter2d_199',['filter2D',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga27c049795ce870216ddfb366086b5a04',1,'cv::filter2D()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga7f2fc386cd3ecb074d65b3ad124f38eb',1,'cv::gapi::filter2D()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga42c2468ab3a1238fbf48458c57169081',1,'cv::hal::filter2D()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga27c049795ce870216ddfb366086b5a04',1,'filter2D(InputArray src, OutputArray dst, int ddepth, InputArray kernel, Point anchor=Point(-1,-1), double delta=0, int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga42c2468ab3a1238fbf48458c57169081',1,'filter2D(int stype, int dtype, int kernel_type, uchar *src_data, size_t src_step, uchar *dst_data, size_t dst_step, int width, int height, int full_width, int full_height, int offset_x, int offset_y, uchar *kernel_data, size_t kernel_step, int kernel_width, int kernel_height, int anchor_x, int anchor_y, double delta, int borderType, bool isSubmatrix)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga7f2fc386cd3ecb074d65b3ad124f38eb',1,'filter2D(const GMat &src, int ddepth, const Mat &kernel, const Point &anchor=Point(-1,-1), const Scalar &delta=Scalar(0), int borderType=BORDER_DEFAULT, const Scalar &borderValue=Scalar(0))(Global Namespace)']]], - ['filter_5f2d_2emarkdown_200',['filter_2d.markdown',['https://docs.opencv.org/4.2.0/d3/db5/filter__2d_8markdown.html',1,'']]], - ['filter_5flr_201',['filter_lr',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a03d0e10ae843a582f5afac7af29337a4',1,'cv::TrackerCSRT::Params']]], - ['filter_5fscharr_202',['FILTER_SCHARR',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggad8e695e87dee497e227716576c244598a460c815d2bb921fb7f53f4220e19c1d5',1,'cv::FILTER_SCHARR'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggad8e695e87dee497e227716576c244598a460c815d2bb921fb7f53f4220e19c1d5',1,'FILTER_SCHARR(Global Namespace)']]], - ['filter_5ftop_5fn_203',['filter_top_n',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#ac85adaf91b32341eb158588e65b5679b',1,'cv::dnn_objdetect::InferBbox']]], - ['filterbyarea_204',['filterByArea',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a890564e4256e98e1ca41724c669735a3',1,'cv::SimpleBlobDetector::Params']]], - ['filterbycircularity_205',['filterByCircularity',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a4929ee3a121d95a6af9710fa9ec5fe4c',1,'cv::SimpleBlobDetector::Params']]], - ['filterbycolor_206',['filterByColor',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a66779ffec01dcc2ab2a6fe570ed7d717',1,'cv::SimpleBlobDetector::Params']]], - ['filterbyconvexity_207',['filterByConvexity',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#ae54a754ab1f2be433a2457994e4c4ac3',1,'cv::SimpleBlobDetector::Params']]], - ['filterbyinertia_208',['filterByInertia',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#af07129ad934a3d12fed2180458445420',1,'cv::SimpleBlobDetector::Params']]], - ['filterhomographydecompbyvisiblerefpoints_209',['filterHomographyDecompByVisibleRefpoints',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga32f867159200f7bd55e72dca92d8494c',1,'cv::filterHomographyDecompByVisibleRefpoints()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga32f867159200f7bd55e72dca92d8494c',1,'filterHomographyDecompByVisibleRefpoints(InputArrayOfArrays rotations, InputArrayOfArrays normals, InputArray beforePoints, InputArray afterPoints, OutputArray possibleSolutions, InputArray pointsMask=noArray())(Global Namespace)']]], - ['filtering_210',['Disparity map post-filtering',['https://docs.opencv.org/4.2.0/d3/d14/tutorial_ximgproc_disparity_filtering.html',1,'']]], - ['filtering_211',['Filtering',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html',1,'Image Filtering'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html',1,'Image Filtering']]], - ['filtering_20using_20f_20transform_212',['Filtering using F-transform',['https://docs.opencv.org/4.2.0/d3/d1d/tutorial_fuzzy_filtering.html',1,'']]], - ['filtering_2emarkdown_213',['filtering.markdown',['https://docs.opencv.org/4.2.0/de/d42/filtering_8markdown.html',1,'']]], - ['filters_214',['Filters',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html',1,'']]], - ['filters_215',['filters',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html',1,'Graph API: Image filters'],['https://docs.opencv.org/4.2.0/d4/dbd/tutorial_filter_2d.html',1,'Making your own linear filters!']]], - ['filters_2ehpp_216',['filters.hpp',['https://docs.opencv.org/4.2.0/d3/d10/filters_8hpp.html',1,'']]], - ['filters_3a_3astatespace_217',['statespace',['../namespacefilters_1_1statespace.html',1,'filters']]], - ['filterspeckles_218',['filterSpeckles',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gabe331f205a6dd7a9aa5db8a38157d25b',1,'cv::filterSpeckles()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gabe331f205a6dd7a9aa5db8a38157d25b',1,'filterSpeckles()(Global Namespace)']]], - ['final_5fprobability_5fdist_219',['final_probability_dist',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a77d8731db72035c2e8dd73ee33278de9',1,'cv::dnn_objdetect::InferBbox']]], - ['final_5fshow_2ehpp_220',['final_show.hpp',['https://docs.opencv.org/4.2.0/db/d19/final__show_8hpp.html',1,'']]], - ['finalframe_5f_221',['finalFrame_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#af52740f8abfa2a537aa64e994f35ef6b',1,'cv::videostab::StabilizerBase']]], - ['finalize_222',['finalize',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a070e355e782f14f97879f18747fd70fc',1,'cv::dnn::Layer::finalize(const std::vector< Mat * > &input, std::vector< Mat > &output)'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a45db2ad86a84737afa623976a957a7e6',1,'cv::dnn::Layer::finalize(InputArrayOfArrays inputs, OutputArrayOfArrays outputs)'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a0b9321b1c809d7804e602b6a862d2217',1,'cv::dnn::Layer::finalize(const std::vector< Mat > &inputs, std::vector< Mat > &outputs)'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a713fddc29f4cb873ea720a2c034dff48',1,'cv::dnn::Layer::finalize(const std::vector< Mat > &inputs)'],['https://docs.opencv.org/4.2.0/de/d47/classcv_1_1viz_1_1WCloudCollection.html#a97c9516c974908628d799c02dc359030',1,'cv::viz::WCloudCollection::finalize()'],['https://docs.opencv.org/4.2.0/df/d97/classcv_1_1viz_1_1WWidgetMerger.html#a03faf9f0cdd111224cede259033308ee',1,'cv::viz::WWidgetMerger::finalize()']]], - ['finalshow_223',['finalShow',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga06724816aad0970637457645ae60c8ca',1,'cvv::finalShow()'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga06724816aad0970637457645ae60c8ca',1,'cvv::impl::finalShow()']]], - ['finalshowcaller_224',['FinalShowCaller',['https://docs.opencv.org/4.2.0/d0/da3/classcvv_1_1FinalShowCaller.html',1,'cvv']]], - ['find_225',['find',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a7914624907986f7a94dd424209a8a609',1,'cv::detail::DpSeamFinder::find()'],['https://docs.opencv.org/4.2.0/db/dda/classcv_1_1detail_1_1GraphCutSeamFinder.html#aea2fc0865be1d3134b8dde43ae3e9dd4',1,'cv::detail::GraphCutSeamFinder::find()'],['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1detail_1_1NoSeamFinder.html#ad51c7e7563d047c8217d051570518b85',1,'cv::detail::NoSeamFinder::find()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a8f7dd0036f534991ec6d02a86dc509a4',1,'cv::detail::PairwiseSeamFinder::find()'],['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html#abaf8facb8e4b77cffcc9085997833989',1,'cv::detail::SeamFinder::find()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af31f0f8c0f55db0640aa8081a593f64e',1,'cv::SparseMat::find(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a782dd472d4a859a13dc77fca7e4ef8a6',1,'cv::SparseMat::find(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#aca75a3e5266b78bafcd01dffe75e563d',1,'cv::SparseMat::find(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a6a68ed5f9b65fa36c3d209c0dafa24a8',1,'cv::SparseMat::find(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af31f0f8c0f55db0640aa8081a593f64e',1,'cv::SparseMat::find(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a782dd472d4a859a13dc77fca7e4ef8a6',1,'cv::SparseMat::find(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#aca75a3e5266b78bafcd01dffe75e563d',1,'cv::SparseMat::find(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a6a68ed5f9b65fa36c3d209c0dafa24a8',1,'cv::SparseMat::find(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/db/d24/classcv_1_1detail_1_1VoronoiSeamFinder.html#a779eced4775e0a2af9e7b7283b0f70f9',1,'cv::detail::VoronoiSeamFinder::find(const std::vector< UMat > &src, const std::vector< Point > &corners, std::vector< UMat > &masks) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/db/d24/classcv_1_1detail_1_1VoronoiSeamFinder.html#a0e48673f52e0ae578e4f4315590b04e1',1,'cv::detail::VoronoiSeamFinder::find(const std::vector< Size > &size, const std::vector< Point > &corners, std::vector< UMat > &masks)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a1cd14e7fb27530a1859047f74e7262f9',1,'__gnu_cxx::__versa_string::find(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a68746de47d8142951be577a34bad453f',1,'__gnu_cxx::__versa_string::find(const __versa_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aff1f1c68135474bef1e118d9f90a0624',1,'__gnu_cxx::__versa_string::find(const _CharT *__s, size_type __pos=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a68d1fb6f098a29470128421c04605a18',1,'__gnu_cxx::__versa_string::find(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'__gnu_debug::basic_string::find()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< _CharT >::find(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< _CharT >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< _CharT >::find(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< _CharT >::find(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< _CharT, _Traits, _Allocator >::find(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< _CharT, _Traits, _Allocator >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< _CharT, _Traits, _Allocator >::find(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< _CharT, _Traits, _Allocator >::find(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find(const _Elem *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find(_Elem __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< char >::find(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< char >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< char >::find(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< char >::find(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< char_type, _Traits, _Alloc >::find(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< char_type, _Traits, _Alloc >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< char_type, _Traits, _Alloc >::find(const char_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< char_type, _Traits, _Alloc >::find(char_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< value_type >::find(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< value_type >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< value_type >::find(const value_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< value_type >::find(value_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'std::basic_string::find(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'std::basic_string::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'std::basic_string::find(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'std::basic_string::find(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#abdcd985632d8ad7ddba069aa776e2dfe',1,'std::map::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a39303b5617b240f3049dbb0d195789f5',1,'std::map::find(const _Kt &__x) -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a07cdb0ebaf753ec1244849dbff2ec4cf',1,'std::map::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#accf5f3477b6615f6b31fcb1adf068dfc',1,'std::map::find(const _Kt &__x) const -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#abdcd985632d8ad7ddba069aa776e2dfe',1,'std::map::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a39303b5617b240f3049dbb0d195789f5',1,'std::map::find(const _Kt &__x) -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a07cdb0ebaf753ec1244849dbff2ec4cf',1,'std::map::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#accf5f3477b6615f6b31fcb1adf068dfc',1,'std::map::find(const _Kt &__x) const -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a3ee75438d859fab67b756b7282a9a4d3',1,'std::multimap::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a84c1e49764e53439674b8f7e8baf33d4',1,'std::multimap::find(const _Kt &__x) -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2cef7a0c61ebd047d63d456e73c7167f',1,'std::multimap::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a71793c903d56962b5f25f08ba76e4196',1,'std::multimap::find(const _Kt &__x) const -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a3ee75438d859fab67b756b7282a9a4d3',1,'std::multimap::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a84c1e49764e53439674b8f7e8baf33d4',1,'std::multimap::find(const _Kt &__x) -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2cef7a0c61ebd047d63d456e73c7167f',1,'std::multimap::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a71793c903d56962b5f25f08ba76e4196',1,'std::multimap::find(const _Kt &__x) const -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a88ae213f5272a4de1e360e1e69335d8b',1,'std::multiset::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae1bc7a281212bde2b7b49e3a7589c0cc',1,'std::multiset::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ad558199cc94a4197f0623861bc955f1a',1,'std::multiset::find(const _Kt &__x) -> decltype(iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae3d52c5bfb2c4ae04923e6bd96a01ae7',1,'std::multiset::find(const _Kt &__x) const -> decltype(const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a88ae213f5272a4de1e360e1e69335d8b',1,'std::multiset::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae1bc7a281212bde2b7b49e3a7589c0cc',1,'std::multiset::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ad558199cc94a4197f0623861bc955f1a',1,'std::multiset::find(const _Kt &__x) -> decltype(iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae3d52c5bfb2c4ae04923e6bd96a01ae7',1,'std::multiset::find(const _Kt &__x) const -> decltype(const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af20eddb69820079242b06871210f9b06',1,'std::set::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af9b85bc6147d2b93a7a470ab20baab1a',1,'std::set::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a70c1741d5e747b2b0a3ae6217fc5906d',1,'std::set::find(const _Kt &__x) -> decltype(iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ac46165e1a88cdf7f318309c2c35f028d',1,'std::set::find(const _Kt &__x) const -> decltype(const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af20eddb69820079242b06871210f9b06',1,'std::set::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af9b85bc6147d2b93a7a470ab20baab1a',1,'std::set::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a70c1741d5e747b2b0a3ae6217fc5906d',1,'std::set::find(const _Kt &__x) -> decltype(iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ac46165e1a88cdf7f318309c2c35f028d',1,'std::set::find(const _Kt &__x) const -> decltype(const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ad62fc2387c4fa4aefe228c14239f8c40',1,'std::unordered_map::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a589217c1b2ed3f77f57aeb41d5192d0d',1,'std::unordered_map::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ad62fc2387c4fa4aefe228c14239f8c40',1,'std::unordered_map::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a589217c1b2ed3f77f57aeb41d5192d0d',1,'std::unordered_map::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a9f64e8fbc46b2fec76e96499ac91c8b6',1,'std::unordered_multimap::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a3a54562ef76d4966a496b86691fdfb12',1,'std::unordered_multimap::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a9f64e8fbc46b2fec76e96499ac91c8b6',1,'std::unordered_multimap::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a3a54562ef76d4966a496b86691fdfb12',1,'std::unordered_multimap::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a3abb4ae4616bf85eb3201d4488007420',1,'std::unordered_multiset::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af99eeb8286c1266dba2e9155f8efe0b6',1,'std::unordered_multiset::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a3abb4ae4616bf85eb3201d4488007420',1,'std::unordered_multiset::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af99eeb8286c1266dba2e9155f8efe0b6',1,'std::unordered_multiset::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#af673d30d52e825e4f8da4c8770f0589b',1,'std::unordered_set::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a1f05b3fd1a72e6b246b0e5ce8d0937cf',1,'std::unordered_set::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#af673d30d52e825e4f8da4c8770f0589b',1,'std::unordered_set::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a1f05b3fd1a72e6b246b0e5ce8d0937cf',1,'std::unordered_set::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ad62fc2387c4fa4aefe228c14239f8c40',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a589217c1b2ed3f77f57aeb41d5192d0d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ad62fc2387c4fa4aefe228c14239f8c40',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a589217c1b2ed3f77f57aeb41d5192d0d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::find(const key_type &__x) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_acdf9b3aab82dcf443dd91ca5ec06b80c.html#acdf9b3aab82dcf443dd91ca5ec06b80c',1,'nlohmann::basic_json::find(KeyT &&key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a17a516671c29a69bb2e11ca12030316b.html#a17a516671c29a69bb2e11ca12030316b',1,'nlohmann::basic_json::find(KeyT &&key) const'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a2486527ac56e07d58946ae9a93a46bc8.html#a2486527ac56e07d58946ae9a93a46bc8',1,'nlohmann::ordered_map::find(const Key &key)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a41e6e34fa8a90b96cbe5c71fec10d2ee.html#a41e6e34fa8a90b96cbe5c71fec10d2ee',1,'nlohmann::ordered_map::find(const Key &key) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga346cc7c0b794d9a487a11b44b6b238ab',1,'std::find()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga346cc7c0b794d9a487a11b44b6b238ab',1,'find(_InputIterator __first, _InputIterator __last, const _Tp &__val)(Global Namespace)']]], - ['find_20a_20known_20object_226',['Features2D + Homography to find a known object',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_feature_homography.html',1,'']]], - ['find_20objects_227',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], - ['find_20plot_20analyze_228',['Find Plot Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], - ['find_2eh_229',['find.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00896.html',1,'']]], - ['find4quadcornersubpix_230',['find4QuadCornerSubpix',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gab8816c8a176e1d78893b843b3f01557a',1,'cv::find4QuadCornerSubpix()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gab8816c8a176e1d78893b843b3f01557a',1,'find4QuadCornerSubpix()(Global Namespace)']]], - ['find_5fby_5forder_231',['find_by_order',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#a514976f742b56de21e6672e674ab62f5',1,'__gnu_pbds::tree_order_statistics_node_update::find_by_order(size_type) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#ac8200dc2f6a2b071509c9a817bc48248',1,'__gnu_pbds::tree_order_statistics_node_update::find_by_order(size_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#ae110b0862e2ece5ba1e6c35c4ac4e2a6',1,'__gnu_pbds::trie_order_statistics_node_update::find_by_order(size_type) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#a635c02fe43bd67dd830531d387e9467c',1,'__gnu_pbds::trie_order_statistics_node_update::find_by_order(size_type)']]], - ['find_5fcontours_2emarkdown_232',['find_contours.markdown',['https://docs.opencv.org/4.2.0/da/d19/find__contours_8markdown.html',1,'']]], - ['find_5fend_233',['find_end',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaf97d3d3c35f24541246e9d222fd45d44',1,'std::find_end(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gac12e9d93b9b26024222cc645d2a4a8d5',1,'std::find_end(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2, _BinaryPredicate __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaf97d3d3c35f24541246e9d222fd45d44',1,'find_end(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gac12e9d93b9b26024222cc645d2a4a8d5',1,'find_end(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2, _BinaryPredicate __comp)(Global Namespace)']]], - ['find_5ffirst_234',['find_first',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aa79a2a1fad69bbaab1be7de6fb5ad37d',1,'std::tr2::dynamic_bitset']]], - ['find_5ffirst_5fnot_5fof_235',['find_first_not_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a1cc1fe69137d69e0d691c83a8b7a877a',1,'__gnu_cxx::__versa_string::find_first_not_of(const __versa_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2a9d4a0f8ffbcaca7a55c874ca69bcaf',1,'__gnu_cxx::__versa_string::find_first_not_of(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a911f590a4037fa8c455eeb69836b83b6',1,'__gnu_cxx::__versa_string::find_first_not_of(const _CharT *__s, size_type __pos=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aa02fafa27ba203b3ebc29fa52c093865',1,'__gnu_cxx::__versa_string::find_first_not_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'__gnu_debug::basic_string::find_first_not_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< _CharT >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< _CharT >::find_first_not_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< _CharT >::find_first_not_of(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< _CharT >::find_first_not_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_not_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_not_of(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_not_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_not_of(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_not_of(const _Elem *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_not_of(_Elem __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< char >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< char >::find_first_not_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< char >::find_first_not_of(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< char >::find_first_not_of(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_not_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_not_of(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_not_of(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< char_type, _Traits, _Alloc >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< char_type, _Traits, _Alloc >::find_first_not_of(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< char_type, _Traits, _Alloc >::find_first_not_of(const char_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< char_type, _Traits, _Alloc >::find_first_not_of(char_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< value_type >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< value_type >::find_first_not_of(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< value_type >::find_first_not_of(const value_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< value_type >::find_first_not_of(value_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'std::basic_string::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'std::basic_string::find_first_not_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'std::basic_string::find_first_not_of(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'std::basic_string::find_first_not_of(_CharT __c, size_type __pos=0) const noexcept']]], - ['find_5ffirst_5fof_236',['find_first_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a51b79cb3c4f9cd8af4cead91f4faa39c',1,'__gnu_cxx::__versa_string::find_first_of(const __versa_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac9799d12f46f0c9ec33d0fd311e1b3c1',1,'__gnu_cxx::__versa_string::find_first_of(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#add4cabafc8f7d3a89e6317b1e690b095',1,'__gnu_cxx::__versa_string::find_first_of(const _CharT *__s, size_type __pos=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a291c0f4c8db9612efad3c478a3a0619d',1,'__gnu_cxx::__versa_string::find_first_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'__gnu_debug::basic_string::find_first_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< _CharT >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< _CharT >::find_first_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< _CharT >::find_first_of(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< _CharT >::find_first_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_of(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_of(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_of(const _Elem *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_of(_Elem __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< char >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< char >::find_first_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< char >::find_first_of(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< char >::find_first_of(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_of(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_of(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< char_type, _Traits, _Alloc >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< char_type, _Traits, _Alloc >::find_first_of(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< char_type, _Traits, _Alloc >::find_first_of(const char_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< char_type, _Traits, _Alloc >::find_first_of(char_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< value_type >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< value_type >::find_first_of(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< value_type >::find_first_of(const value_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< value_type >::find_first_of(value_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'std::basic_string::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'std::basic_string::find_first_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'std::basic_string::find_first_of(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'std::basic_string::find_first_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga5f2c547c925b080c25f17765a755a0cb',1,'std::find_first_of(_InputIterator __first1, _InputIterator __last1, _ForwardIterator __first2, _ForwardIterator __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga4f6564022032cfc6ea5c24b6dce5b4a7',1,'std::find_first_of(_InputIterator __first1, _InputIterator __last1, _ForwardIterator __first2, _ForwardIterator __last2, _BinaryPredicate __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga5f2c547c925b080c25f17765a755a0cb',1,'find_first_of(_InputIterator __first1, _InputIterator __last1, _ForwardIterator __first2, _ForwardIterator __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga4f6564022032cfc6ea5c24b6dce5b4a7',1,'find_first_of(_InputIterator __first1, _InputIterator __last1, _ForwardIterator __first2, _ForwardIterator __last2, _BinaryPredicate __comp)(Global Namespace)']]], - ['find_5fif_237',['find_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaaf6e9995ebbd27994d7c73b375f86088',1,'std::find_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaaf6e9995ebbd27994d7c73b375f86088',1,'find_if()(Global Namespace)']]], - ['find_5fif_5fnot_238',['find_if_not',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaa0bfffb70439c7d2cab9e917e8d604a6',1,'std::find_if_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaa0bfffb70439c7d2cab9e917e8d604a6',1,'find_if_not()(Global Namespace)']]], - ['find_5fincreasing_5ffactor_239',['find_increasing_factor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a9450672486f402afac0c0741fe1d76a8',1,'__gnu_parallel::_Settings']]], - ['find_5finitial_5fblock_5fsize_240',['find_initial_block_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a52caf5becdee8026dc2bf029f46e15d1',1,'__gnu_parallel::_Settings']]], - ['find_5flast_5fnot_5fof_241',['find_last_not_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a44ea35572c1492b236ddc2b5977309bb',1,'__gnu_cxx::__versa_string::find_last_not_of(const __versa_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a85e9808581c06885d492a7dc230b9c3d',1,'__gnu_cxx::__versa_string::find_last_not_of(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a69d482699c2e775c7f62dcb9392c7ada',1,'__gnu_cxx::__versa_string::find_last_not_of(const _CharT *__s, size_type __pos=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2e8dd285274cf21efe56bb58792ac67a',1,'__gnu_cxx::__versa_string::find_last_not_of(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'__gnu_debug::basic_string::find_last_not_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< _CharT >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< _CharT >::find_last_not_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< _CharT >::find_last_not_of(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< _CharT >::find_last_not_of(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_not_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_not_of(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_not_of(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_not_of(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_not_of(const _Elem *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_not_of(_Elem __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< char >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< char >::find_last_not_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< char >::find_last_not_of(const char *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< char >::find_last_not_of(char __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_not_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_not_of(const char *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_not_of(char __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< char_type, _Traits, _Alloc >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< char_type, _Traits, _Alloc >::find_last_not_of(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< char_type, _Traits, _Alloc >::find_last_not_of(const char_type *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< char_type, _Traits, _Alloc >::find_last_not_of(char_type __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< value_type >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< value_type >::find_last_not_of(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< value_type >::find_last_not_of(const value_type *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< value_type >::find_last_not_of(value_type __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'std::basic_string::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'std::basic_string::find_last_not_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'std::basic_string::find_last_not_of(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'std::basic_string::find_last_not_of(_CharT __c, size_type __pos=npos) const noexcept']]], - ['find_5flast_5fof_242',['find_last_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a14963706e6c95eea43af12f44d9b95ad',1,'__gnu_cxx::__versa_string::find_last_of(const __versa_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#add62aca46b830b7b503354a0e5da6dfc',1,'__gnu_cxx::__versa_string::find_last_of(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a12fc7455ac41d07a9350824d71d5ab3a',1,'__gnu_cxx::__versa_string::find_last_of(const _CharT *__s, size_type __pos=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae533d7eec1df0fb48aeaf38195134214',1,'__gnu_cxx::__versa_string::find_last_of(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'__gnu_debug::basic_string::find_last_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< _CharT >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< _CharT >::find_last_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< _CharT >::find_last_of(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< _CharT >::find_last_of(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_of(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_of(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_of(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_of(const _Elem *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_of(_Elem __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< char >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< char >::find_last_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< char >::find_last_of(const char *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< char >::find_last_of(char __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_of(const char *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_of(char __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< char_type, _Traits, _Alloc >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< char_type, _Traits, _Alloc >::find_last_of(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< char_type, _Traits, _Alloc >::find_last_of(const char_type *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< char_type, _Traits, _Alloc >::find_last_of(char_type __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< value_type >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< value_type >::find_last_of(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< value_type >::find_last_of(const value_type *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< value_type >::find_last_of(value_type __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'std::basic_string::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'std::basic_string::find_last_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'std::basic_string::find_last_of(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'std::basic_string::find_last_of(_CharT __c, size_type __pos=npos) const noexcept']]], - ['find_5fmaximum_5fblock_5fsize_243',['find_maximum_block_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a6e85e9dffe870aad7d2155188b3dea99',1,'__gnu_parallel::_Settings']]], - ['find_5fnext_244',['find_next',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a011bdf5c380085fc00c15c368b060624',1,'std::tr2::dynamic_bitset']]], - ['find_5fno_5fstore_5fhash_5ffn_5fimps_2ehpp_245',['find_no_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01301.html',1,'']]], - ['find_5fscale_5ffactor_246',['find_scale_factor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ad1123e5b2d57ff40c415d893cfbf5a11',1,'__gnu_parallel::_Settings']]], - ['find_5fselectors_2eh_247',['find_selectors.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00899.html',1,'']]], - ['find_5fsequential_5fsearch_5fsize_248',['find_sequential_search_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a755b0ae67b24dfe7d6f436e097a49620',1,'__gnu_parallel::_Settings']]], - ['find_5ftag_249',['find_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09731.html',1,'__gnu_parallel']]], - ['findchessboardcorners_250',['findChessboardCorners',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga93efa9b0aa890de240ca32b11253dd4a',1,'cv::findChessboardCorners()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga93efa9b0aa890de240ca32b11253dd4a',1,'findChessboardCorners()(Global Namespace)']]], - ['findchessboardcornerssb_251',['findChessboardCornersSB',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad0e88e13cd3d410870a99927510d7f91',1,'cv::findChessboardCornersSB()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad0e88e13cd3d410870a99927510d7f91',1,'findChessboardCornersSB()(Global Namespace)']]], - ['findchild_252',['findChild',['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#a05a7b1bb6798e5935eb061117b1bf435',1,'cv::Node::findChild(OBJECT &payload) const'],['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#a40acd5b53d7b3a60de989c00b47c2208',1,'cv::Node::findChild(Node< OBJECT > *pNode) const']]], - ['findcirclesgrid_253',['findCirclesGrid',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga7f02cd21c8352142890190227628fa80',1,'cv::findCirclesGrid(InputArray image, Size patternSize, OutputArray centers, int flags, const Ptr< FeatureDetector > &blobDetector, const CirclesGridFinderParameters &parameters)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gac8fb88c7652a7699743aeb6073ef9b4a',1,'cv::findCirclesGrid(InputArray image, Size patternSize, OutputArray centers, int flags=CALIB_CB_SYMMETRIC_GRID, const Ptr< FeatureDetector > &blobDetector=SimpleBlobDetector::create())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga7f02cd21c8352142890190227628fa80',1,'findCirclesGrid(InputArray image, Size patternSize, OutputArray centers, int flags, const Ptr< FeatureDetector > &blobDetector, const CirclesGridFinderParameters &parameters)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gac8fb88c7652a7699743aeb6073ef9b4a',1,'findCirclesGrid(InputArray image, Size patternSize, OutputArray centers, int flags=CALIB_CB_SYMMETRIC_GRID, const Ptr< FeatureDetector > &blobDetector=SimpleBlobDetector::create())(Global Namespace)']]], - ['findcontours_254',['findContours',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gadf1ad6a0b82947fa1fe3c3d497f260e0',1,'cv::findContours(InputArray image, OutputArrayOfArrays contours, OutputArray hierarchy, int mode, int method, Point offset=Point())'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gae4156f04053c44f886e387cff0ef6e08',1,'cv::findContours(InputArray image, OutputArrayOfArrays contours, int mode, int method, Point offset=Point())'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gadf1ad6a0b82947fa1fe3c3d497f260e0',1,'findContours(InputArray image, OutputArrayOfArrays contours, OutputArray hierarchy, int mode, int method, Point offset=Point())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gae4156f04053c44f886e387cff0ef6e08',1,'findContours(InputArray image, OutputArrayOfArrays contours, int mode, int method, Point offset=Point())(Global Namespace)']]], - ['findcorrespondences_255',['findCorrespondences',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga91c50d0cd4b35a72f3850f87fddec2cb',1,'cv::optflow::GPCForest::findCorrespondences()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga91c50d0cd4b35a72f3850f87fddec2cb',1,'findCorrespondences()(Global Namespace)']]], - ['findessentialmat_256',['findEssentialMat',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga13f7e34de8fa516a686a56af1196247f',1,'cv::findEssentialMat(InputArray points1, InputArray points2, InputArray cameraMatrix, int method=RANSAC, double prob=0.999, double threshold=1.0, OutputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga0c86f6478f36d5be6e450751bbf4fec0',1,'cv::findEssentialMat(InputArray points1, InputArray points2, double focal=1.0, Point2d pp=Point2d(0, 0), int method=RANSAC, double prob=0.999, double threshold=1.0, OutputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga13f7e34de8fa516a686a56af1196247f',1,'findEssentialMat(InputArray points1, InputArray points2, InputArray cameraMatrix, int method=RANSAC, double prob=0.999, double threshold=1.0, OutputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga0c86f6478f36d5be6e450751bbf4fec0',1,'findEssentialMat(InputArray points1, InputArray points2, double focal=1.0, Point2d pp=Point2d(0, 0), int method=RANSAC, double prob=0.999, double threshold=1.0, OutputArray mask=noArray())(Global Namespace)']]], - ['findfile_257',['findFile',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html#ga3a33b00033b46c698ff6340d95569c13',1,'cv::samples::findFile()'],['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html#ga3a33b00033b46c698ff6340d95569c13',1,'findFile()(Global Namespace)']]], - ['findfileorkeep_258',['findFileOrKeep',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html#ga4a37595bcd267558bd6c176c7307f050',1,'cv::samples::findFileOrKeep()'],['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html#ga4a37595bcd267558bd6c176c7307f050',1,'findFileOrKeep()(Global Namespace)']]], - ['findfundamentalmat_259',['findFundamentalMat',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gae420abc34eaa03d0c6a67359609d8429',1,'cv::findFundamentalMat(InputArray points1, InputArray points2, int method=FM_RANSAC, double ransacReprojThreshold=3., double confidence=0.99, OutputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga49ea1a98c80a5e7d50ad4361dcf2877a',1,'cv::findFundamentalMat(InputArray points1, InputArray points2, OutputArray mask, int method=FM_RANSAC, double ransacReprojThreshold=3., double confidence=0.99)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gae420abc34eaa03d0c6a67359609d8429',1,'findFundamentalMat(InputArray points1, InputArray points2, int method=FM_RANSAC, double ransacReprojThreshold=3., double confidence=0.99, OutputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga49ea1a98c80a5e7d50ad4361dcf2877a',1,'findFundamentalMat(InputArray points1, InputArray points2, OutputArray mask, int method=FM_RANSAC, double ransacReprojThreshold=3., double confidence=0.99)(Global Namespace)']]], - ['findhomography_260',['findHomography',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga4abc2ece9fab9398f2e560d53c8c9780',1,'cv::findHomography(InputArray srcPoints, InputArray dstPoints, int method=0, double ransacReprojThreshold=3, OutputArray mask=noArray(), const int maxIters=2000, const double confidence=0.995)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gafd3ef89257e27d5235f4467cbb1b6a63',1,'cv::findHomography(InputArray srcPoints, InputArray dstPoints, OutputArray mask, int method=0, double ransacReprojThreshold=3)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga4abc2ece9fab9398f2e560d53c8c9780',1,'findHomography(InputArray srcPoints, InputArray dstPoints, int method=0, double ransacReprojThreshold=3, OutputArray mask=noArray(), const int maxIters=2000, const double confidence=0.995)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gafd3ef89257e27d5235f4467cbb1b6a63',1,'findHomography(InputArray srcPoints, InputArray dstPoints, OutputArray mask, int method=0, double ransacReprojThreshold=3)(Global Namespace)']]], - ['finding_20and_20images_20matching_261',['Features Finding and Images Matching',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'']]], - ['finding_20contours_20in_20your_20image_262',['Finding contours in your image',['https://docs.opencv.org/4.2.0/df/d0d/tutorial_find_contours.html',1,'']]], - ['findinpair_263',['findInPair',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a8e2d33396c0a012c7a256db8337435c6',1,'cv::detail::PairwiseSeamFinder']]], - ['findleafforpatch_264',['findLeafForPatch',['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#a6a0557a84e7c270037ba1af441dde526',1,'cv::optflow::GPCTree']]], - ['findmaxspanningtree_265',['findMaxSpanningTree',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gadb39c8dec819cf596194465bde94f4d2',1,'cv::detail::findMaxSpanningTree()'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gadb39c8dec819cf596194465bde94f4d2',1,'findMaxSpanningTree()(Global Namespace)']]], - ['findmaxvalexprbody_266',['FindMaxValExprBody',['https://docs.opencv.org/4.2.0/d9/d48/structcv_1_1cudev_1_1FindMaxValExprBody.html',1,'cv::cudev']]], - ['findmedian_267',['findMedian',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#ac02adc0c5f2a55ce62d684d34f59e857',1,'cv::omnidir::internal']]], - ['findmedian3_268',['findMedian3',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#ab91013ecd20ffd8e9f5f651f413a7a9e',1,'cv::omnidir::internal']]], - ['findminmax_269',['findMinMax',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gae7f5f2aa9f65314470a76fccdff887f2',1,'cv::cuda::findMinMax()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gae7f5f2aa9f65314470a76fccdff887f2',1,'findMinMax()(Global Namespace)']]], - ['findminmaxloc_270',['findMinMaxLoc',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga93916bc473a62d215d1130fab84d090a',1,'cv::cuda::findMinMaxLoc()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga93916bc473a62d215d1130fab84d090a',1,'findMinMaxLoc()(Global Namespace)']]], - ['findminmaxvalexprbody_271',['FindMinMaxValExprBody',['https://docs.opencv.org/4.2.0/dd/db3/structcv_1_1cudev_1_1FindMinMaxValExprBody.html',1,'cv::cudev']]], - ['findminvalexprbody_272',['FindMinValExprBody',['https://docs.opencv.org/4.2.0/df/d82/structcv_1_1cudev_1_1FindMinValExprBody.html',1,'cv::cudev']]], - ['findnearest_273',['findNearest',['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#a312f975c24725b57200e221a97474b45',1,'cv::ml::KNearest::findNearest()'],['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a3ec256af000e129e08eb5f269ccdeb0f',1,'cv::Subdiv2D::findNearest()']]], - ['findnonzero_274',['findNonZero',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaed7df59a3539b4cc0fe5c9c8d7586190',1,'cv::findNonZero()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaed7df59a3539b4cc0fe5c9c8d7586190',1,'findNonZero()(Global Namespace)']]], - ['findpattern_275',['findPattern',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a968d86b3c84215f91e992e961352287b',1,'cv::ccalib::CustomPattern']]], - ['findprocammatches_276',['findProCamMatches',['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1structured__light_1_1SinusoidalPattern.html#a38e038bd6af04cc2add84f2d16daafd4',1,'cv::structured_light::SinusoidalPattern']]], - ['findrt_277',['findRt',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#ae16f40289d6f364a772ca46863d61a09',1,'cv::ccalib::CustomPattern::findRt(InputArray objectPoints, InputArray imagePoints, InputArray cameraMatrix, InputArray distCoeffs, InputOutputArray rvec, InputOutputArray tvec, bool useExtrinsicGuess=false, int flags=SOLVEPNP_ITERATIVE)'],['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#af718c66db3c5aca64ad160366f97dbff',1,'cv::ccalib::CustomPattern::findRt(InputArray image, InputArray cameraMatrix, InputArray distCoeffs, InputOutputArray rvec, InputOutputArray tvec, bool useExtrinsicGuess=false, int flags=SOLVEPNP_ITERATIVE)']]], - ['findrtransac_278',['findRtRANSAC',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a2d22157c9b5f8ba7ee88abc1078d8223',1,'cv::ccalib::CustomPattern::findRtRANSAC(InputArray objectPoints, InputArray imagePoints, InputArray cameraMatrix, InputArray distCoeffs, InputOutputArray rvec, InputOutputArray tvec, bool useExtrinsicGuess=false, int iterationsCount=100, float reprojectionError=8.0, int minInliersCount=100, OutputArray inliers=noArray(), int flags=SOLVEPNP_ITERATIVE)'],['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#af10afe143eb9fe66755bf14f44a0ddb5',1,'cv::ccalib::CustomPattern::findRtRANSAC(InputArray image, InputArray cameraMatrix, InputArray distCoeffs, InputOutputArray rvec, InputOutputArray tvec, bool useExtrinsicGuess=false, int iterationsCount=100, float reprojectionError=8.0, int minInliersCount=100, OutputArray inliers=noArray(), int flags=SOLVEPNP_ITERATIVE)']]], - ['findsetbyelem_279',['findSetByElem',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#a4f61a6ddc6663de58ad177d5ab92d943',1,'cv::detail::DisjointSets']]], - ['findtransformecc_280',['findTransformECC',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga1aa357007eaec11e9ed03500ecbcbe47',1,'cv::findTransformECC(InputArray templateImage, InputArray inputImage, InputOutputArray warpMatrix, int motionType, TermCriteria criteria, InputArray inputMask, int gaussFiltSize)'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga7ded46f9a55c0364c92ccd2019d43e3a',1,'cv::findTransformECC(InputArray templateImage, InputArray inputImage, InputOutputArray warpMatrix, int motionType=MOTION_AFFINE, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 50, 0.001), InputArray inputMask=noArray())'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga1aa357007eaec11e9ed03500ecbcbe47',1,'findTransformECC(InputArray templateImage, InputArray inputImage, InputOutputArray warpMatrix, int motionType, TermCriteria criteria, InputArray inputMask, int gaussFiltSize)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga7ded46f9a55c0364c92ccd2019d43e3a',1,'findTransformECC(InputArray templateImage, InputArray inputImage, InputOutputArray warpMatrix, int motionType=MOTION_AFFINE, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 50, 0.001), InputArray inputMask=noArray())(Global Namespace)']]], - ['finish_281',['finish',['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#ad00e1adfb5e708624ed2685be06885fc',1,'cv::ocl::Queue::finish()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gabfca32247f267c662b3bff6587d14b40',1,'cv::ocl::finish()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gabfca32247f267c662b3bff6587d14b40',1,'finish()(Global Namespace)']]], - ['finished_282',['finished',['https://eigen.tuxfamily.org/dox/structEigen_1_1CommaInitializer.html#a3cf9e2b8a227940f50103130b2d2859a',1,'Eigen::CommaInitializer']]], - ['finishwriteavi_283',['finishWriteAVI',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#aa51fe5ae4e23f88b3aeb43e72bc51714',1,'cv::AVIWriteContainer']]], - ['first_284',['first',['https://docs.opencv.org/4.2.0/dd/d1c/classcv_1_1gapi_1_1wip_1_1GCaptureSource.html#a3a21970aea469f6b388be220c20feaff',1,'cv::gapi::wip::GCaptureSource::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'__gnu_parallel::_IteratorPair::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< _Bi_iter, _Bi_iter >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< _BiIter, _BiIter >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< _Iterator1, _Iterator2 >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< _RAIter, _RAIter >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< char, _TokenT >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< char, char >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< entry_pointer, typename _Alloc::size_type >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'std::pair::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'std::sub_match::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'sub_match< _Bi_iter >::first'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArithmeticSequence.html#a3b0d096fb8fad937f2a210217afc454b',1,'Eigen::ArithmeticSequence::first()']]], - ['first_5fargument_5ftype_285',['first_argument_type',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'cv::cudev::binary_function::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< double, double, double >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< float, float, float >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< Predicate::first_argument_type, Predicate::second_argument_type, Predicate::result_type >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< schar, schar, float >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< schar, schar, schar >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< short, short, float >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< short, short, short >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< T1, T2, T1 >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< T1, T2, T2 >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< uchar, uchar, float >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< uchar, uchar, uchar >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< uint, uint, float >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< uint, uint, uint >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< ushort, ushort, float >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< ushort, ushort, ushort >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_cxx::project1st::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_cxx::project2nd::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_EqualFromLess::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_EqualTo::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_Less::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_Lexicographic::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_LexicographicReverse::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_Multiplies::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_Plus::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< __shared_ptr< _Tp, _Lp >, __shared_ptr< _Tp, _Lp >, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< __weak_ptr< _Tp, _Lp >, __weak_ptr< _Tp, _Lp >, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Arg1, _Arg2, _Arg1 >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Arg1, _Arg2, _Arg2 >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Predicate::first_argument_type, _Predicate::second_argument_type, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _T1, _T2, _Res >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _T1, _T2, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Tp *, _Arg, _Ret >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Tp *, _Tp *, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Tp, _Arg, _Ret >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Tp, _Tp, _Tp >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Tp, _Tp, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Tp1, _Tp2, _Result >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< const _Tp *, _Arg, _Ret >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< rope< _CharT, _Alloc >, rope< _CharT, _Alloc >, rope< _CharT, _Alloc > >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< shared_ptr< _Tp >, shared_ptr< _Tp >, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< std::pair< _T1, _T2 >, std::pair< _T1, _T2 >, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< value_type, value_type, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< void, void, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< weak_ptr< _Tp >, weak_ptr< _Tp >, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::_Maybe_unary_or_binary_function< _Res, _T1, _T2 >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::binary_function::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::binary_negate::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::const_mem_fun1_ref_t::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::const_mem_fun1_t::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::divides::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::equal_to::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::experimental::fundamentals_v2::owner_less< shared_ptr< _Tp > >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::experimental::fundamentals_v2::owner_less< weak_ptr< _Tp > >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::greater::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::greater_equal::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::less::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::less_equal::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::logical_and::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::logical_or::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::mem_fun1_ref_t::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::mem_fun1_t::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::minus::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::modulus::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::multiplies::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::not_equal_to::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::owner_less< shared_ptr< _Tp > >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::owner_less< void >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::owner_less< weak_ptr< _Tp > >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::plus::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::pointer_to_binary_function::first_argument_type']]], - ['first_5fobject_286',['first_object',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a0e039b5feca33a6d86ae8027408ae4cf',1,'cv::tbm::Track']]], - ['first_5fpulled_287',['first_pulled',['https://docs.opencv.org/4.2.0/dd/d1c/classcv_1_1gapi_1_1wip_1_1GCaptureSource.html#a097a5707f5b992ae3418ca0cb55c76fb',1,'cv::gapi::wip::GCaptureSource']]], - ['firstedge_288',['firstEdge',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a07bb3543d958161a1916c4c942df1626',1,'cv::Subdiv2D::Vertex']]], - ['fisher_5ff_5fdistribution_289',['fisher_f_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html',1,'std']]], - ['fisherfacerecognizer_290',['FisherFaceRecognizer',['https://docs.opencv.org/4.2.0/d2/de9/classcv_1_1face_1_1FisherFaceRecognizer.html',1,'cv::face']]], - ['fisheye_20camera_20model_291',['Fisheye camera model',['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html',1,'']]], - ['fisheyeprojector_292',['FisheyeProjector',['https://docs.opencv.org/4.2.0/d9/de9/structcv_1_1detail_1_1FisheyeProjector.html',1,'cv::detail']]], - ['fisheyewarper_293',['FisheyeWarper',['https://docs.opencv.org/4.2.0/d9/dac/classcv_1_1detail_1_1FisheyeWarper.html',1,'cv::detail::FisheyeWarper'],['https://docs.opencv.org/4.2.0/d5/d30/classcv_1_1FisheyeWarper.html',1,'cv::FisheyeWarper'],['https://docs.opencv.org/4.2.0/d9/dac/classcv_1_1detail_1_1FisheyeWarper.html#ad67ecc3a118fc6025ef308852f46b63c',1,'cv::detail::FisheyeWarper::FisheyeWarper()']]], - ['fist_294',['fist',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga82775e152f8a74c5fe06f5a7343e0233a96440bcf7f90afff850728efd5aabf56',1,'cv::datasets::fist'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga82775e152f8a74c5fe06f5a7343e0233a96440bcf7f90afff850728efd5aabf56',1,'fist(Global Namespace)']]], - ['fit_295',['fit',['https://docs.opencv.org/4.2.0/db/dd8/classcv_1_1face_1_1Facemark.html#a9c21865859a685d16746f0097e9b3d26',1,'cv::face::Facemark']]], - ['fitconfig_296',['fitConfig',['https://docs.opencv.org/4.2.0/d5/d7b/classcv_1_1face_1_1FacemarkAAM.html#a4c72f54aecf28a11b6d01a8ddce6e01d',1,'cv::face::FacemarkAAM']]], - ['fitellipse_297',['fitEllipse',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf259efaad93098103d6c27b9e4900ffa',1,'cv::fitEllipse()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf259efaad93098103d6c27b9e4900ffa',1,'fitEllipse()(Global Namespace)']]], - ['fitellipseams_298',['fitEllipseAMS',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga69e90cda55c4e192a8caa0b99c3e4550',1,'cv::fitEllipseAMS()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga69e90cda55c4e192a8caa0b99c3e4550',1,'fitEllipseAMS()(Global Namespace)']]], - ['fitellipsedirect_299',['fitEllipseDirect',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga6421884fd411923a74891998bbe9e813',1,'cv::fitEllipseDirect()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga6421884fd411923a74891998bbe9e813',1,'fitEllipseDirect()(Global Namespace)']]], - ['fitline_300',['fitLine',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf849da1fdafa67ee84b1e9a23b93f91f',1,'cv::fitLine()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf849da1fdafa67ee84b1e9a23b93f91f',1,'fitLine()(Global Namespace)']]], - ['fix_301',['fix',['https://eigen.tuxfamily.org/dox/group__Core__Module.html#gac01f234bce100e39e6928fdc470e5194',1,'Eigen::fix()'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html#ga3ce50da8ca83238949c06afce1a4f3c7',1,'Eigen::fix(int val)'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html#gac01f234bce100e39e6928fdc470e5194',1,'fix()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html#ga3ce50da8ca83238949c06afce1a4f3c7',1,'fix(int val)(Global Namespace)']]], - ['fixcamerayawaxis_302',['fixCameraYawAxis',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a3df77148958eb408d7e7d16e30ffc244',1,'cv::ovis::WindowScene']]], - ['fixed_303',['fixed',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_ios< char, _Traits >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_iostream< char >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_istream< char >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_istream< char, _Traits >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_ostream< char >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_ostream< char, _Traits >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_fstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ifstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ios::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_iostream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_istream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_istringstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ofstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ostream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ostringstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_stringstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::ios_base::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af52d7537a34e913e7fb3f0ec2f27a8f2',1,'std::fixed()']]], - ['fixed_20size_20vectorizable_20eigen_20objects_304',['Fixed-size vectorizable Eigen objects',['https://eigen.tuxfamily.org/dox/group__TopicFixedSizeVectorizable.html',1,'']]], - ['fixed_5fsize_305',['FIXED_SIZE',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba4eb3928003c50a19e08aebee36ed3a7e',1,'cv::_InputArray']]], - ['fixed_5ftype_306',['FIXED_TYPE',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba517c23e91976c6c72e6cb025fae551aa',1,'cv::_InputArray']]], - ['fixedsize_307',['fixedSize',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ab8b119e910915d4d39317994750f2e35',1,'cv::_OutputArray']]], - ['fixedtype_308',['fixedType',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a2aa22d85b6a332142c3767a09297e1c2',1,'cv::_OutputArray']]], - ['flagged_309',['flagged',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae5815e87ecd984879138601e24f56422',1,'Eigen::DenseBase::flagged()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae5815e87ecd984879138601e24f56422',1,'DenseBase< ArrayWrapper< ExpressionType > >::flagged()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae5815e87ecd984879138601e24f56422',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::flagged()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae5815e87ecd984879138601e24f56422',1,'DenseBase< Solve< Decomposition, RhsType > >::flagged()']]], - ['flags_310',['flags',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#af3be19723301164bb9932133f550149f',1,'cv::_InputArray::flags'],['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#aa0a8079aa21df8ab4d8fd7769eedf79a',1,'cv::BOWKMeansTrainer::flags'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#adfd242b365e79ebc382a0829d8e9f44f',1,'cv::cuda::GpuMat::flags'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#af81a4ce11a420f2905f7666d5545c674',1,'cv::cuda::HostMem::flags'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a6c2adb1ffd71913a3c37ea4f0e0583f5',1,'cv::ocl::KernelArg::flags'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af9333f06c84f115fda4cdf3af18c2ad0',1,'cv::Mat::flags'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a039a50c85f8475f06e3aecb9fb9b0f0c',1,'cv::MatExpr::flags'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a94a639f4af82b43e32307b34b28a8193',1,'cv::gapi::own::detail::MatHeader::flags'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ad5f261bc8c1330e4e516684861410cd2',1,'cv::SparseMat::flags'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ad662d8ae2354913ddee4374cb5a86808',1,'cv::UMat::flags'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#abd20502f4de49d5bf2fe2147d3f49d83',1,'cv::UMatData::flags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'basic_ios< char, _Traits >::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'basic_ios< char, _Traits >::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'basic_iostream< char >::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'basic_iostream< char >::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'basic_istream< char >::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'basic_istream< char >::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'basic_istream< char, _Traits >::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'basic_istream< char, _Traits >::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'basic_ostream< char >::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'basic_ostream< char >::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'basic_ostream< char, _Traits >::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'basic_ostream< char, _Traits >::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_fstream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_fstream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_ifstream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_ifstream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_ios::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_ios::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_iostream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_iostream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_istream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_istream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_istringstream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_istringstream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_ofstream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_ofstream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_ostream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_ostream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_ostringstream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_ostringstream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#ac3473fa27e545da4b9d74eb61fa72401',1,'std::basic_regex::flags()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_stringstream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_stringstream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::ios_base::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::ios_base::flags(fmtflags __fmtfl)']]], - ['flags_311',['Flags',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a7afa5cd2289fb88989c0ab1b8b5d8ac2',1,'cv::ml::DTrees::Flags'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#ae8a94a2add0555b0414e85c08ff67f50',1,'cv::PCA::Flags'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af1ea864e1c19796e6264ebb3950c0b9a',1,'cv::ml::StatModel::Flags'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a4700f5207e66cdd9924bf64e34911832',1,'cv::SVD::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'Eigen::DenseBase::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'DenseBase< ArrayWrapper< ExpressionType > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'DenseBase< Solve< Decomposition, RhsType > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'Eigen::SparseMatrixBase::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< Transpose< MatrixType > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::Flags']]], - ['flags_312',['FLAGS',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612',1,'cv::instr']]], - ['flags_313',['Flags',['https://eigen.tuxfamily.org/dox/group__flags.html',1,'']]], - ['flags_20for_20video_20i_20o_314',['Flags for video I/O',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html',1,'']]], - ['flags_20for_20video_20i_20o_20api_20backends_315',['Additional flags for video I/O API backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'']]], - ['flags2idx_316',['flags2idx',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#ac11b28b72254863b09873d0dd9e115ef',1,'cv::omnidir::internal']]], - ['flags2idxstereo_317',['flags2idxStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a5d0af87fbd3e0639376713687b02f98e',1,'cv::omnidir::internal']]], - ['flags_5fexpand_5fsame_5fnames_318',['FLAGS_EXPAND_SAME_NAMES',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612a0f3b3d3a281bf899e129650268314e8f',1,'cv::instr']]], - ['flags_5fmapping_319',['FLAGS_MAPPING',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612a2179656df5cb2d063fc7d4cd7832c674',1,'cv::instr']]], - ['flags_5fnone_320',['FLAGS_NONE',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612a7cb3d7e2fb9323ea58c26d71b0b5ad41',1,'cv::instr']]], - ['flann_321',['Feature Matching with FLANN',['https://docs.opencv.org/4.2.0/d5/d6f/tutorial_feature_flann_matcher.html',1,'']]], - ['flann_2ehpp_322',['flann.hpp',['https://docs.opencv.org/4.2.0/d4/d45/flann_2flann_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/dc1/flann_8hpp.html',1,'(Global Namespace)']]], - ['flann_5fbase_2ehpp_323',['flann_base.hpp',['https://docs.opencv.org/4.2.0/d3/dd7/flann__base_8hpp.html',1,'']]], - ['flann_5fdistance_5ftype_324',['flann_distance_type',['https://docs.opencv.org/4.2.0/dc/d8c/namespacecvflann.html#acefb2bb801db2e24fa23e3d3a0b11585',1,'cvflann']]], - ['flannbased_325',['FLANNBASED',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3baf73d671c6860c24f44b2880a77fadcdc',1,'cv::DescriptorMatcher']]], - ['flannbasedmatcher_326',['FlannBasedMatcher',['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html',1,'cv::FlannBasedMatcher'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#ab9114a6471e364ad221f89068ca21382',1,'cv::FlannBasedMatcher::FlannBasedMatcher(const Ptr< flann::IndexParams > &indexParams=makePtr< flann::KDTreeIndexParams >(), const Ptr< flann::SearchParams > &searchParams=makePtr< flann::SearchParams >())']]], - ['flannindex_327',['flannIndex',['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a293108def96df8a5f19ea0897e548ff2',1,'cv::FlannBasedMatcher']]], - ['flat_328',['flat',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga82775e152f8a74c5fe06f5a7343e0233a6306dd1c0bf0644fbae4ca9083032da9',1,'cv::datasets::flat'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga82775e152f8a74c5fe06f5a7343e0233a6306dd1c0bf0644fbae4ca9083032da9',1,'flat(Global Namespace)']]], - ['flatten_329',['flatten',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab7aa6e048e659481a036f2d872c7cba6.html#ab7aa6e048e659481a036f2d872c7cba6',1,'nlohmann::basic_json']]], - ['flatten_5fg_330',['flatten_g',['https://docs.opencv.org/4.2.0/dd/d3b/structcv_1_1detail_1_1flatten__g.html',1,'cv::detail']]], - ['flatten_5fg_3c_20cv_3a_3agmat_20_3e_331',['flatten_g< cv::GMat >',['https://docs.opencv.org/4.2.0/df/de8/structcv_1_1detail_1_1flatten__g_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], - ['flatten_5fg_3c_20cv_3a_3agscalar_20_3e_332',['flatten_g< cv::GScalar >',['https://docs.opencv.org/4.2.0/d5/d97/structcv_1_1detail_1_1flatten__g_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], - ['flattenlayer_333',['FlattenLayer',['https://docs.opencv.org/4.2.0/d4/da3/classcv_1_1dnn_1_1FlattenLayer.html',1,'cv::dnn']]], - ['flip_334',['flip',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a74c7d5b72d4bdc578f796f6f382b7b76',1,'std::bitset::flip() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac1664aa3a88a766504c14fa38c824522',1,'std::bitset::flip(size_t __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aaab99f0e8e5208a515482e4b549f4dc9',1,'std::tr2::dynamic_bitset::flip()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a53285bcbf85cc3b61ebbc6a6360aafe3',1,'std::tr2::dynamic_bitset::flip(size_type __pos)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaca7be533e3dac7feb70fc60635adf441',1,'cv::flip()'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga4d0a3f2b46e8f0f1ec2b5ac178dcd871',1,'cv::cuda::flip()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaa5d151bf720b9e4186ca3d415dc879c7',1,'cv::gapi::flip()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaca7be533e3dac7feb70fc60635adf441',1,'flip(InputArray src, OutputArray dst, int flipCode)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaa5d151bf720b9e4186ca3d415dc879c7',1,'flip(const GMat &src, int flipCode)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga4d0a3f2b46e8f0f1ec2b5ac178dcd871',1,'flip(InputArray src, OutputArray dst, int flipCode, Stream &stream=Stream::Null())(Global Namespace)']]], - ['float_335',['FLOAT',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45abaa6f858f3ef3a2735b6ef8016d3bb3e',1,'cv::FileNode::FLOAT'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aae738c26bf4ce1037fa81b039a915cbf6',1,'FLOAT(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aae738c26bf4ce1037fa81b039a915cbf6',1,'FLOAT(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aae738c26bf4ce1037fa81b039a915cbf6',1,'FLOAT(Global Namespace)']]], - ['float16_5ft_336',['float16_t',['https://docs.opencv.org/4.2.0/df/dc9/classcv_1_1float16__t.html',1,'cv::float16_t'],['https://docs.opencv.org/4.2.0/df/dc9/classcv_1_1float16__t.html#ad18d9740ade824e6fc60a045a74b9db7',1,'cv::float16_t::float16_t()'],['https://docs.opencv.org/4.2.0/df/dc9/classcv_1_1float16__t.html#a7f071717a3caa0042fbe23a8e7783e7b',1,'cv::float16_t::float16_t(float x)']]], - ['float_5fdenorm_5fstyle_337',['float_denorm_style',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d4e3dd02abab45dde95b5bb4ae7fdbf',1,'std']]], - ['float_5fround_5fstyle_338',['float_round_style',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53dbc8572a84ca50272f9e55a1e23e18',1,'std']]], - ['float_5ftype_339',['float_type',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a2730bcb4f97187be1ceda0a58994bb53',1,'cv::Affine3::float_type'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a2730bcb4f97187be1ceda0a58994bb53',1,'Affine3< float >::float_type']]], - ['floatfield_340',['floatfield',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'basic_ios< char, _Traits >::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'basic_iostream< char >::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'basic_istream< char >::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'basic_istream< char, _Traits >::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'basic_ostream< char >::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'basic_ostream< char, _Traits >::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_fstream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_ifstream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_ios::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_iostream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_istream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_istringstream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_ofstream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_ostream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_ostringstream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_stringstream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::ios_base::floatfield']]], - ['floating_20point_20arithmetic_341',['Decimal Floating-Point Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01520.html',1,'']]], - ['floattype_342',['FloatType',['https://docs.opencv.org/4.2.0/d8/d4e/structcv_1_1cudev_1_1functional__detail_1_1FloatType.html',1,'cv::cudev::functional_detail']]], - ['floodfill_343',['floodFill',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaf1f55a048f8a45bc3383586e80b1f0d0',1,'cv::floodFill(InputOutputArray image, Point seedPoint, Scalar newVal, Rect *rect=0, Scalar loDiff=Scalar(), Scalar upDiff=Scalar(), int flags=4)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga366aae45a6c1289b341d140839f18717',1,'cv::floodFill(InputOutputArray image, InputOutputArray mask, Point seedPoint, Scalar newVal, Rect *rect=0, Scalar loDiff=Scalar(), Scalar upDiff=Scalar(), int flags=4)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaf1f55a048f8a45bc3383586e80b1f0d0',1,'floodFill(InputOutputArray image, Point seedPoint, Scalar newVal, Rect *rect=0, Scalar loDiff=Scalar(), Scalar upDiff=Scalar(), int flags=4)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga366aae45a6c1289b341d140839f18717',1,'floodFill(InputOutputArray image, InputOutputArray mask, Point seedPoint, Scalar newVal, Rect *rect=0, Scalar loDiff=Scalar(), Scalar upDiff=Scalar(), int flags=4)(Global Namespace)']]], - ['floodfill_5ffixed_5frange_344',['FLOODFILL_FIXED_RANGE',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggab87810a476a9cb660435a4cd7871c9eba8aafb7a6a87df91c7624d44f4b092fe3',1,'cv::FLOODFILL_FIXED_RANGE'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggab87810a476a9cb660435a4cd7871c9eba8aafb7a6a87df91c7624d44f4b092fe3',1,'FLOODFILL_FIXED_RANGE(Global Namespace)']]], - ['floodfill_5fmask_5fonly_345',['FLOODFILL_MASK_ONLY',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggab87810a476a9cb660435a4cd7871c9eba7161dca1d0b9e84e5208c7e8021b4d3a',1,'cv::FLOODFILL_MASK_ONLY'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggab87810a476a9cb660435a4cd7871c9eba7161dca1d0b9e84e5208c7e8021b4d3a',1,'FLOODFILL_MASK_ONLY(Global Namespace)']]], - ['floodfillflags_346',['FloodFillFlags',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gab87810a476a9cb660435a4cd7871c9eb',1,'cv::FloodFillFlags'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gab87810a476a9cb660435a4cd7871c9eb',1,'FloodFillFlags(Global Namespace)']]], - ['floor_347',['floor',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#abf03d773a87830bc7fde51bcd94c89a0',1,'Eigen']]], - ['floord_348',['floord',['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a9a5f3e924d9d2b8c8de768bc3895c68b',1,'cv::gapi::own']]], - ['flow_349',['FLOW',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a6341540fa16ae64960926d977ecba81c',1,'cv::FileNode']]], - ['flow_350',['Flow',['https://docs.opencv.org/4.2.0/d7/d3f/group__cudaoptflow.html',1,'Optical Flow'],['https://docs.opencv.org/4.2.0/d4/dee/tutorial_optical_flow.html',1,'Optical Flow'],['https://docs.opencv.org/4.2.0/d7/d8b/tutorial_py_lucas_kanade.html',1,'Optical Flow'],['https://docs.opencv.org/4.2.0/db/d7f/tutorial_js_lucas_kanade.html',1,'Optical Flow']]], - ['flow_20algorithms_351',['Optical Flow Algorithms',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html',1,'']]], - ['flowerrorthreshold_352',['flowErrorThreshold',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#a984ec65a4e029e6ca2e3205ba2f3ffd9',1,'cv::videostab::MotionInpainter']]], - ['fluid_5fget_5fin_353',['fluid_get_in',['https://docs.opencv.org/4.2.0/d3/d36/structcv_1_1detail_1_1fluid__get__in.html',1,'cv::detail']]], - ['fluid_5fget_5fin_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_354',['fluid_get_in< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/d1/dde/structcv_1_1detail_1_1fluid__get__in_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], - ['fluid_5fget_5fin_3c_20cv_3a_3agmat_20_3e_355',['fluid_get_in< cv::GMat >',['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1detail_1_1fluid__get__in_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], - ['fluid_5fget_5fin_3c_20cv_3a_3agscalar_20_3e_356',['fluid_get_in< cv::GScalar >',['https://docs.opencv.org/4.2.0/d8/de3/structcv_1_1detail_1_1fluid__get__in_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], - ['fluidcallhelper_357',['FluidCallHelper',['https://docs.opencv.org/4.2.0/d6/daf/structcv_1_1detail_1_1FluidCallHelper.html',1,'cv::detail']]], - ['fluidcallhelper_3c_20impl_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20outs_2e_2e_2e_20_3e_2c_20usescratch_20_3e_358',['FluidCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... >, UseScratch >',['https://docs.opencv.org/4.2.0/d4/d77/structcv_1_1detail_1_1FluidCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_16cb3b081e952d44068dce53ded07afdc.html',1,'cv::detail']]], - ['flush_359',['flush',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'basic_iostream< char >::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'basic_ostream< char >::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'basic_ostream< char, _Traits >::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'std::basic_fstream::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'std::basic_iostream::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'std::basic_ofstream::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'std::basic_ostream::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'std::basic_ostringstream::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'std::basic_stringstream::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8b74d0bc34dda8d29dd0950b4e5e661d',1,'std::flush()']]], - ['fm_5f7point_360',['FM_7POINT',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02a8ccd232f3e7691efae984c76bb99e047',1,'cv::FM_7POINT'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02a8ccd232f3e7691efae984c76bb99e047',1,'FM_7POINT(Global Namespace)']]], - ['fm_5f8point_361',['FM_8POINT',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02a3960f8c87052a64c3297704db34aaedf',1,'cv::FM_8POINT'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02a3960f8c87052a64c3297704db34aaedf',1,'FM_8POINT(Global Namespace)']]], - ['fm_5flmeds_362',['FM_LMEDS',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02a8a81ff35b40a5de086bc91dbc1ef8bba',1,'cv::FM_LMEDS'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02a8a81ff35b40a5de086bc91dbc1ef8bba',1,'FM_LMEDS(Global Namespace)']]], - ['fm_5fransac_363',['FM_RANSAC',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02aeb30cc6b8fc94600bc04f16c14644fdd',1,'cv::FM_RANSAC'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02aeb30cc6b8fc94600bc04f16c14644fdd',1,'FM_RANSAC(Global Namespace)']]], - ['fmt_364',['fmt',['https://docs.opencv.org/4.2.0/d7/d0e/classcv_1_1DataDepth.html#a022386121e1e1241c5a999976d4b5956ae5030288b4884074c6dd94c287ab31ba',1,'cv::DataDepth']]], - ['fmt_5fc_365',['FMT_C',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08eadf3c07708afbb7a0abfef260f9e71251',1,'cv::Formatter']]], - ['fmt_5fcsv_366',['FMT_CSV',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08ea1582de9020e4f0f01adedadc257315a8',1,'cv::Formatter']]], - ['fmt_5fdefault_367',['FMT_DEFAULT',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08eafa0150ad2e95a3657487ba482d0e6457',1,'cv::Formatter']]], - ['fmt_5fmatlab_368',['FMT_MATLAB',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08eac296692aec2ddf485727c6458e95c30d',1,'cv::Formatter']]], - ['fmt_5fnumpy_369',['FMT_NUMPY',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08ea945acfdf2a741d281b25d566aff8e330',1,'cv::Formatter']]], - ['fmt_5fpython_370',['FMT_PYTHON',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08ead7aff265f8074ea43014e2b4199faaa3',1,'cv::Formatter']]], - ['fmtflags_371',['fmtflags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'basic_ios< char, _Traits >::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'basic_iostream< char >::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'basic_istream< char >::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'basic_istream< char, _Traits >::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'basic_ostream< char >::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'basic_ostream< char, _Traits >::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_fstream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_ifstream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_ios::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_iostream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_istream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_istringstream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_ofstream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_ostream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_ostringstream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_stringstream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::ios_base::fmtflags']]], - ['fn_5ffacedetector_372',['FN_FaceDetector',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gae0bc3cfe0eb0cccde1fc0d91c6cde9db',1,'cv::face::FN_FaceDetector'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gae0bc3cfe0eb0cccde1fc0d91c6cde9db',1,'FN_FaceDetector(Global Namespace)']]], - ['focal_373',['focal',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#a9af414e5bbf7063c105ce8c9a2ec36ba',1,'cv::detail::CameraParams']]], - ['focal_5flength_5fx_374',['focal_length_x',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a175a0ace6e27a419e26ec948e69f024c',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['focal_5flength_5fy_375',['focal_length_y',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a5b35252bf045707640b06b9ba3fd6e04',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], - ['focalsfromhomography_376',['focalsFromHomography',['https://docs.opencv.org/4.2.0/d4/dbc/group__stitching__autocalib.html#ga0d78f56152790435703b556e0f5840f1',1,'cv::detail::focalsFromHomography()'],['https://docs.opencv.org/4.2.0/d4/dbc/group__stitching__autocalib.html#ga0d78f56152790435703b556e0f5840f1',1,'focalsFromHomography(const Mat &H, double &f0, double &f1, bool &f0_ok, bool &f1_ok)(Global Namespace)']]], - ['focus_20deblur_20filter_377',['Out-of-focus Deblur Filter',['https://docs.opencv.org/4.2.0/de/d3c/tutorial_out_of_focus_deblur_filter.html',1,'']]], - ['font_5fface_378',['font_face',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#ad839059de1e0b7fdba986f04a1c923db',1,'cv::QtFont']]], - ['font_5fhershey_5fcomplex_379',['FONT_HERSHEY_COMPLEX',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11af7b1b25521fc9b5731a97cfd13460c2a',1,'cv::FONT_HERSHEY_COMPLEX'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11af7b1b25521fc9b5731a97cfd13460c2a',1,'FONT_HERSHEY_COMPLEX(Global Namespace)']]], - ['font_5fhershey_5fcomplex_5fsmall_380',['FONT_HERSHEY_COMPLEX_SMALL',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11adfd28fc57520df956e00c7a26fb718ed',1,'cv::FONT_HERSHEY_COMPLEX_SMALL'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11adfd28fc57520df956e00c7a26fb718ed',1,'FONT_HERSHEY_COMPLEX_SMALL(Global Namespace)']]], - ['font_5fhershey_5fduplex_381',['FONT_HERSHEY_DUPLEX',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11ab307bdc73fdd06074acad940115bda7a',1,'cv::FONT_HERSHEY_DUPLEX'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11ab307bdc73fdd06074acad940115bda7a',1,'FONT_HERSHEY_DUPLEX(Global Namespace)']]], - ['font_5fhershey_5fplain_382',['FONT_HERSHEY_PLAIN',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a08cf3b0a37729fbb62a3007d499cbd8b',1,'cv::FONT_HERSHEY_PLAIN'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a08cf3b0a37729fbb62a3007d499cbd8b',1,'FONT_HERSHEY_PLAIN(Global Namespace)']]], - ['font_5fhershey_5fscript_5fcomplex_383',['FONT_HERSHEY_SCRIPT_COMPLEX',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a8e7f6a22d4aec98c59375649eee1c696',1,'cv::FONT_HERSHEY_SCRIPT_COMPLEX'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a8e7f6a22d4aec98c59375649eee1c696',1,'FONT_HERSHEY_SCRIPT_COMPLEX(Global Namespace)']]], - ['font_5fhershey_5fscript_5fsimplex_384',['FONT_HERSHEY_SCRIPT_SIMPLEX',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a58de14ee43572b502c8cb71f788e9fdc',1,'cv::FONT_HERSHEY_SCRIPT_SIMPLEX'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a58de14ee43572b502c8cb71f788e9fdc',1,'FONT_HERSHEY_SCRIPT_SIMPLEX(Global Namespace)']]], - ['font_5fhershey_5fsimplex_385',['FONT_HERSHEY_SIMPLEX',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11afff8b973668df2e4028dddc5274310c9',1,'cv::FONT_HERSHEY_SIMPLEX'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11afff8b973668df2e4028dddc5274310c9',1,'FONT_HERSHEY_SIMPLEX(Global Namespace)']]], - ['font_5fhershey_5ftriplex_386',['FONT_HERSHEY_TRIPLEX',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a2880034c653349b7f9fcc2bb60342fc6',1,'cv::FONT_HERSHEY_TRIPLEX'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a2880034c653349b7f9fcc2bb60342fc6',1,'FONT_HERSHEY_TRIPLEX(Global Namespace)']]], - ['font_5fitalic_387',['FONT_ITALIC',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11af0f7c8824fe42205076771a7b67661c2',1,'cv::FONT_ITALIC'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11af0f7c8824fe42205076771a7b67661c2',1,'FONT_ITALIC(Global Namespace)']]], - ['font_5fsize_388',['FONT_SIZE',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca58e5b5d44537f61d9b5d590ca4c3c28f',1,'cv::viz::FONT_SIZE'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca58e5b5d44537f61d9b5d590ca4c3c28f',1,'FONT_SIZE(Global Namespace)']]], - ['fontqt_389',['fontQt',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga6281d0939583c9e0ee36372dfeb52ae3',1,'cv::fontQt()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga6281d0939583c9e0ee36372dfeb52ae3',1,'fontQt(const String &nameFont, int pointSize=-1, Scalar color=Scalar::all(0), int weight=QT_FONT_NORMAL, int style=QT_STYLE_NORMAL, int spacing=0)(Global Namespace)']]], - ['for_203d_20object_20classification_20and_20pose_20estimation_390',['CNN for 3D Object Classification and Pose Estimation',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'']]], - ['for_203d_20reconstruction_391',['Custom Calibration Pattern for 3D reconstruction',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html',1,'']]], - ['for_20arm_20based_20linux_20systems_392',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]], - ['for_20bgsegm_20module_393',['Tutorials for bgsegm module',['https://docs.opencv.org/4.2.0/d3/d89/tutorial_table_of_content_bgsegm.html',1,'']]], - ['for_20contours_394',['for contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'Creating Bounding boxes and circles for contours'],['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'Creating Bounding rotated boxes and ellipses for contours']]], - ['for_20contrib_20modules_395',['Tutorials for contrib modules',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_contrib_root.html',1,'']]], - ['for_20corner_20detection_396',['FAST Algorithm for Corner Detection',['https://docs.opencv.org/4.2.0/df/d0c/tutorial_py_fast.html',1,'']]], - ['for_20efficient_20image_20segmentation_397',['Hierarchical Feature Selection for Efficient Image Segmentation',['https://docs.opencv.org/4.2.0/dc/d29/group__hfs.html',1,'']]], - ['for_20external_20libraries_20plugins_398',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], - ['for_20face_20module_399',['Tutorials for face module',['https://docs.opencv.org/4.2.0/de/d27/tutorial_table_of_content_face.html',1,'']]], - ['for_20fast_20edge_20detection_400',['for fast edge detection',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html',1,'Structured forests for fast edge detection'],['https://docs.opencv.org/4.2.0/d0/da5/tutorial_ximgproc_prediction.html',1,'Structured forests for fast edge detection']]], - ['for_20halide_20backend_401',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], - ['for_20image_20processing_402',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], - ['for_20improve_20efficiency_403',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], - ['for_20interactive_20visual_20debugging_20of_20computer_20vision_20programs_404',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], - ['for_20lines_20extracted_20from_20an_20image_405',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], - ['for_20mat_20data_406',['Plot function for Mat data',['https://docs.opencv.org/4.2.0/db/dfe/group__plot.html',1,'']]], - ['for_20new_20layers_20registration_407',['Utilities for New Layers Registration',['https://docs.opencv.org/4.2.0/df/dc1/group__dnnLayerFactory.html',1,'']]], - ['for_20non_20linearly_20separable_20data_408',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], - ['for_20object_20detection_409',['DNN used for object detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'']]], - ['for_20opencv_410',['Writing documentation for OpenCV',['https://docs.opencv.org/4.2.0/d4/db1/tutorial_documentation.html',1,'']]], - ['for_20opencv_20samples_411',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]], - ['for_20pointers_20to_20functions_412',['Adaptors for pointers to functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html',1,'']]], - ['for_20pointers_20to_20members_413',['Adaptors for pointers to members',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01511.html',1,'']]], - ['for_20sparse_20matrices_414',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], - ['for_20super_20resolution_415',['DNN used for super resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'']]], - ['for_20tegra_20with_20cuda_416',['Building OpenCV for Tegra with CUDA',['https://docs.opencv.org/4.2.0/d6/d15/tutorial_building_tegra_cuda.html',1,'']]], - ['for_20video_20capture_417',['Image Processing for Video Capture',['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'']]], - ['for_20video_20i_20o_418',['for video I O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__c.html',1,'C API for video I/O'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html',1,'Flags for video I/O'],['https://docs.opencv.org/4.2.0/d5/d26/group__videoio__ios.html',1,'iOS glue for video I/O'],['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html',1,'WinRT glue for video I/O']]], - ['for_20video_20i_20o_20api_20backends_419',['Additional flags for video I/O API backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'']]], - ['for_20working_20with_20different_20datasets_420',['Framework for working with different datasets',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html',1,'']]], - ['for_5feach_421',['for_each',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga36d3b88a382b4ad3bf55aff3f597522d',1,'std::for_each()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga36d3b88a382b4ad3bf55aff3f597522d',1,'for_each(_InputIterator __first, _InputIterator __last, _Function __f)(Global Namespace)']]], - ['for_5feach_2eh_422',['for_each.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00902.html',1,'']]], - ['for_5feach_5fminimal_5fn_423',['for_each_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a334f583634130237ff56881c3e3e9570',1,'__gnu_parallel::_Settings']]], - ['for_5feach_5fselectors_2eh_424',['for_each_selectors.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00905.html',1,'']]], - ['forcealignedaccess_425',['ForceAlignedAccess',['https://eigen.tuxfamily.org/dox/classEigen_1_1ForceAlignedAccess.html',1,'Eigen']]], - ['forcealignedaccess_426',['forceAlignedAccess',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb6e1b10c5f3d130100089dca3c5ee06',1,'Eigen::MatrixBase::forceAlignedAccess()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb6e1b10c5f3d130100089dca3c5ee06',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::forceAlignedAccess()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb6e1b10c5f3d130100089dca3c5ee06',1,'MatrixBase< Solve< Decomposition, RhsType > >::forceAlignedAccess()']]], - ['forcealignedaccessif_427',['forceAlignedAccessIf',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae35213d1dd4dd13ebe9a7a762d6bb847',1,'Eigen::MatrixBase::forceAlignedAccessIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#af42d92f115d4b8fa3d5aa731ed496ed1',1,'Eigen::MatrixBase::forceAlignedAccessIf() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae35213d1dd4dd13ebe9a7a762d6bb847',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::forceAlignedAccessIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#af42d92f115d4b8fa3d5aa731ed496ed1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::forceAlignedAccessIf() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae35213d1dd4dd13ebe9a7a762d6bb847',1,'MatrixBase< Solve< Decomposition, RhsType > >::forceAlignedAccessIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#af42d92f115d4b8fa3d5aa731ed496ed1',1,'MatrixBase< Solve< Decomposition, RhsType > >::forceAlignedAccessIf() const']]], - ['forced_5ferror_428',['forced_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10675.html',1,'__gnu_cxx']]], - ['forceidr_429',['ForceIDR',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#aa968a810ecec3b6cbc50e4f930b5f83f',1,'cv::cudacodec::EncoderParams']]], - ['forceintra_430',['ForceIntra',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a9becd1f21a6b0d550117f366fe748abb',1,'cv::cudacodec::EncoderParams']]], - ['foreach_431',['forEach',['https://docs.opencv.org/4.2.0/dc/d4c/classcv_1_1detail_1_1Graph.html#ae240a8d6ee21deaee7617e459597b042',1,'cv::detail::Graph::forEach()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a952ef1a85d70a510240cb645a90efc0d',1,'cv::Mat::forEach(const Functor &operation)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#afcee31e71fd6991148fd3bb619971e2b',1,'cv::Mat::forEach(const Functor &operation) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5ed4d525bbaf681c0885e9d059b81a75',1,'cv::Mat_::forEach(const Functor &operation)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3bc25901f088bb64e866240c969def60',1,'cv::Mat_::forEach(const Functor &operation) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5ed4d525bbaf681c0885e9d059b81a75',1,'Mat_< double >::forEach(const Functor &operation)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3bc25901f088bb64e866240c969def60',1,'Mat_< double >::forEach(const Functor &operation) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5ed4d525bbaf681c0885e9d059b81a75',1,'Mat_< float >::forEach(const Functor &operation)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3bc25901f088bb64e866240c969def60',1,'Mat_< float >::forEach(const Functor &operation) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5ed4d525bbaf681c0885e9d059b81a75',1,'Mat_< uchar >::forEach(const Functor &operation)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3bc25901f088bb64e866240c969def60',1,'Mat_< uchar >::forEach(const Functor &operation) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5ed4d525bbaf681c0885e9d059b81a75',1,'Mat_< unsigned char >::forEach(const Functor &operation)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3bc25901f088bb64e866240c969def60',1,'Mat_< unsigned char >::forEach(const Functor &operation) const']]], - ['foreach_5fimpl_432',['forEach_impl',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaa9eb8c7cba44b791827d0cd685206273',1,'cv::Mat::forEach_impl()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaa9eb8c7cba44b791827d0cd685206273',1,'forEach_impl(const Functor &operation)(Global Namespace)']]], - ['foreground_20extraction_20using_20grabcut_20algorithm_433',['Foreground Extraction using GrabCut Algorithm',['https://docs.opencv.org/4.2.0/dd/dfc/tutorial_js_grabcut.html',1,'Foreground Extraction using GrabCut Algorithm'],['https://docs.opencv.org/4.2.0/d8/d83/tutorial_py_grabcut.html',1,'Interactive Foreground Extraction using GrabCut Algorithm']]], - ['foreground_20segmentation_20methods_434',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], - ['forest_20training_435',['Structured forest training',['https://docs.opencv.org/4.2.0/d2/d59/tutorial_ximgproc_training.html',1,'']]], - ['forests_20for_20fast_20edge_20detection_436',['forests for fast edge detection',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html',1,'Structured forests for fast edge detection'],['https://docs.opencv.org/4.2.0/d0/da5/tutorial_ximgproc_prediction.html',1,'Structured forests for fast edge detection']]], - ['forget_5fdelay_437',['forget_delay',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a28c5211e31078d18558d03ced44f8ba8',1,'cv::tbm::TrackerParams']]], - ['format_438',['Format',['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1838399ee67c0957c0ae42cabfa99033',1,'cv::ogl::Texture2D']]], - ['format_439',['format',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#a73aaf40fda3872332aff523cf01eeb02',1,'cv::Formatter::format()'],['https://docs.opencv.org/4.2.0/d6/d55/classcv_1_1cudacodec_1_1RawVideoSource.html#a099a86ffcd64dd390c843162f3d97b31',1,'cv::cudacodec::RawVideoSource::format()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a99d34ec6c0656c850cb8ed2280453879',1,'cv::ogl::Texture2D::format()'],['https://docs.opencv.org/4.2.0/db/ded/classcv_1_1cudacodec_1_1VideoReader.html#a317027f37e8d45ca3aa41c19c8c862b6',1,'cv::cudacodec::VideoReader::format()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4a8d689c2bf7f9a32e1cdc9462cb9ca5',1,'match_results< _Bi_iter >::format(_Out_iter __out, const char_type *__fmt_first, const char_type *__fmt_last, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a75078225998ca82f96787929ba9d7646',1,'match_results< _Bi_iter >::format(_Out_iter __out, const basic_string< char_type, _St, _Sa > &__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6dd64effbedc4db4891802952f0b226e',1,'match_results< _Bi_iter >::format(const basic_string< char_type, _St, _Sa > &__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#acb9033dc604fc3ddd6a611de43e2857a',1,'match_results< _Bi_iter >::format(const char_type *__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4a8d689c2bf7f9a32e1cdc9462cb9ca5',1,'match_results< _Bi_iter >::format(_Out_iter __out, const char_type *__fmt_first, const char_type *__fmt_last, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a75078225998ca82f96787929ba9d7646',1,'match_results< _Bi_iter >::format(_Out_iter __out, const basic_string< char_type, _St, _Sa > &__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6dd64effbedc4db4891802952f0b226e',1,'match_results< _Bi_iter >::format(const basic_string< char_type, _St, _Sa > &__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#acb9033dc604fc3ddd6a611de43e2857a',1,'match_results< _Bi_iter >::format(const char_type *__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4a8d689c2bf7f9a32e1cdc9462cb9ca5',1,'std::match_results::format(_Out_iter __out, const char_type *__fmt_first, const char_type *__fmt_last, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a75078225998ca82f96787929ba9d7646',1,'std::match_results::format(_Out_iter __out, const basic_string< char_type, _St, _Sa > &__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6dd64effbedc4db4891802952f0b226e',1,'std::match_results::format(const basic_string< char_type, _St, _Sa > &__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#acb9033dc604fc3ddd6a611de43e2857a',1,'std::match_results::format(const char_type *__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab231f1a6057f28d4244145e12c9fc0c7',1,'Eigen::DenseBase::format()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab231f1a6057f28d4244145e12c9fc0c7',1,'DenseBase< ArrayWrapper< ExpressionType > >::format()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab231f1a6057f28d4244145e12c9fc0c7',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::format()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab231f1a6057f28d4244145e12c9fc0c7',1,'DenseBase< Solve< Decomposition, RhsType > >::format()']]], - ['format_440',['Top-Level Format',['../cameraconfig.html#toplevel',1,'']]], - ['format_20hdf_20i_20o_441',['The Hierarchical Data Format (hdf) I/O',['https://docs.opencv.org/4.2.0/d3/d00/tutorial_table_of_content_hdf.html',1,'']]], - ['format_20i_20o_20routines_442',['Hierarchical Data Format I/O routines',['https://docs.opencv.org/4.2.0/db/d77/group__hdf.html',1,'']]], - ['format_20tt_443',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], - ['format_20version_205_444',['Hierarchical Data Format version 5',['https://docs.opencv.org/4.2.0/d6/dee/group__hdf5.html',1,'']]], - ['format_5fauto_445',['FORMAT_AUTO',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da5c1854b1f439d35644c7475791f3c47e',1,'cv::FileStorage']]], - ['format_5fdefault_446',['format_default',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ae8280c4746ec140dd2ad2106cbf787ad',1,'std::regex_constants']]], - ['format_5ffirst_5fonly_447',['format_first_only',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a0fc5b8b99c305b71cd713055afc983f9',1,'std::regex_constants']]], - ['format_5fjson_448',['FORMAT_JSON',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da65cebec1331fd20338511b2f5f31efe4',1,'cv::FileStorage']]], - ['format_5fmask_449',['FORMAT_MASK',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482dafa2bc69eece7e0210b59a0c7113d5b3e',1,'cv::FileStorage']]], - ['format_5fno_5fcopy_450',['format_no_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a65253b87e3f2138870e2d827ea5b4ea9',1,'std::regex_constants']]], - ['format_5fsed_451',['format_sed',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a3553e3ac3560a881732c367dcf567549',1,'std::regex_constants']]], - ['format_5fxml_452',['FORMAT_XML',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da753a7b441d2876fa8a77009472108356',1,'cv::FileStorage']]], - ['format_5fyaml_453',['FORMAT_YAML',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da63e7a7dcb2d68359210dc5fc8c83e92d',1,'cv::FileStorage']]], - ['formatinfo_454',['FormatInfo',['https://docs.opencv.org/4.2.0/d8/db6/structcv_1_1cudacodec_1_1FormatInfo.html',1,'cv::cudacodec']]], - ['formatmessage_455',['formatMessage',['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#afe6c2198ca3815de5385fd93f81f2c34',1,'cv::Exception']]], - ['formatted_456',['Formatted',['https://docs.opencv.org/4.2.0/d4/df3/classcv_1_1Formatted.html',1,'cv']]], - ['formatter_457',['Formatter',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html',1,'cv']]], - ['formatter_2eh_458',['formatter.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00755.html',1,'']]], - ['formatting_459',['Formatting',['../md_StyleGuide.html#autotoc_md2',1,'']]], - ['formatting_20with_20tt_20clang_20format_20tt_460',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], - ['formattype_461',['FormatType',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08e',1,'cv::Formatter']]], - ['forward_462',['forward',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a39236126b72a365b94b132abd5bd946b',1,'cv::dnn::Layer::forward(std::vector< Mat * > &input, std::vector< Mat > &output, std::vector< Mat > &internals)'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#ab3c05d3e918cd96c39bc95aee0522353',1,'cv::dnn::Layer::forward(InputArrayOfArrays inputs, OutputArrayOfArrays outputs, OutputArrayOfArrays internals)'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a98ed94cb6ef7063d3697259566da310b',1,'cv::dnn::Net::forward(const String &outputName=String())'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a8d248f50efec70dffa785de18a4b2170',1,'cv::dnn::Net::forward(OutputArrayOfArrays outputBlobs, const String &outputName=String())'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#adb34d7650e555264c7da3b47d967311b',1,'cv::dnn::Net::forward(OutputArrayOfArrays outputBlobs, const std::vector< String > &outBlobNames)'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a00e707a86b2da4f980f9342b1fc2cc92',1,'cv::dnn::Net::forward(std::vector< std::vector< Mat > > &outputBlobs, const std::vector< String > &outBlobNames)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gacb5baec338e12b99cb6bddea7506c7c6',1,'std::forward(typename std::remove_reference< _Tp >::type &__t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gade8e8737b971a056c0ebba2de0295467',1,'std::forward(typename std::remove_reference< _Tp >::type &&__t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gacb5baec338e12b99cb6bddea7506c7c6',1,'forward(typename std::remove_reference< _Tp >::type &__t) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gade8e8737b971a056c0ebba2de0295467',1,'forward(typename std::remove_reference< _Tp >::type &&__t) noexcept(Global Namespace)']]], - ['forward_5fas_5ftuple_463',['forward_as_tuple',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gabb17aea09199e2c250d78b7657837144',1,'std::forward_as_tuple()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gabb17aea09199e2c250d78b7657837144',1,'forward_as_tuple()(Global Namespace)']]], - ['forward_5ffallback_464',['forward_fallback',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#ae240acf2b7ad43531ca903c927334c8a',1,'cv::dnn::Layer']]], - ['forward_5fiterator_5ftag_465',['forward_iterator_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07699.html',1,'std']]], - ['forward_5flist_466',['forward_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08843.html',1,'std::__debug::forward_list< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09111.html',1,'std::__profile::forward_list< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html',1,'std::forward_list< _Tp, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00065.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a2d179d6a061a4e6d8dcea244cdc29fe7',1,'std::forward_list::forward_list()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a4876e29ab044344ca726a36b6cdca01b',1,'std::forward_list::forward_list(const _Alloc &__al) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a43d0c48b0ef128ee0431be85c8fdd843',1,'std::forward_list::forward_list(const forward_list &__list, const _Alloc &__al)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a3a1601333d918ce64f330bf97c142e4c',1,'std::forward_list::forward_list(forward_list &&__list, const _Alloc &__al) noexcept(_Node_alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a950f84e93e993ce756a016954c4322db',1,'std::forward_list::forward_list(size_type __n, const _Alloc &__al=_Alloc())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a81dc09fa341ed4c54da852f6a430bba2',1,'std::forward_list::forward_list(size_type __n, const _Tp &__value, const _Alloc &__al=_Alloc())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac9a366e3ba3ca40c479e0f33e664e6e7',1,'std::forward_list::forward_list(_InputIterator __first, _InputIterator __last, const _Alloc &__al=_Alloc())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a642ecbf961b6a99a7deb77e676e71cac',1,'std::forward_list::forward_list(const forward_list &__list)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac57eaebb7af37579e166cb2c2b753f53',1,'std::forward_list::forward_list(forward_list &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a925933047508f0bd16df276c4f0261e4',1,'std::forward_list::forward_list(std::initializer_list< _Tp > __il, const _Alloc &__al=_Alloc())']]], - ['forward_5flist_2eh_467',['forward_list.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00338.html',1,'']]], - ['forward_5flist_2etcc_468',['forward_list.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00341.html',1,'']]], - ['forwardarmkinematics_469',['ForwardArmKinematics',['../classkinematics_1_1ForwardArmKinematics.html',1,'kinematics']]], - ['forwardarmkinematics_3c_202_2c_20n_20_3e_470',['ForwardArmKinematics< 2, N >',['../classkinematics_1_1ForwardArmKinematics.html',1,'kinematics']]], - ['forwardasync_471',['forwardAsync',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a814890154ea9e10b132fec00b6f6ba30',1,'cv::dnn::Net']]], - ['forwardslice_472',['forwardSlice',['https://docs.opencv.org/4.2.0/dc/d75/classcv_1_1dnn_1_1ActivationLayer.html#aad4adf2e0dbc14a7618e395c0f898ac1',1,'cv::dnn::ActivationLayer']]], - ['fourcc_473',['fourcc',['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#afec93f94dc6c0b3e28f4dd153bc5a7f0',1,'cv::VideoWriter']]], - ['fourier_20descriptors_474',['Fourier descriptors',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html',1,'']]], - ['fourier_20transform_475',['Fourier Transform',['https://docs.opencv.org/4.2.0/d8/d01/tutorial_discrete_fourier_transform.html',1,'Discrete Fourier Transform'],['https://docs.opencv.org/4.2.0/de/dbc/tutorial_py_fourier_transform.html',1,'Fourier Transform'],['https://docs.opencv.org/4.2.0/dd/d02/tutorial_js_fourier_transform.html',1,'Fourier Transform']]], - ['fourier_5fdescriptors_2ehpp_476',['fourier_descriptors.hpp',['https://docs.opencv.org/4.2.0/db/d75/fourier__descriptors_8hpp.html',1,'']]], - ['fourierdescriptor_477',['fourierDescriptor',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#gac929d241e37cc33fdb59969d1b197dd2',1,'cv::ximgproc::fourierDescriptor()'],['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#gac929d241e37cc33fdb59969d1b197dd2',1,'fourierDescriptor()(Global Namespace)']]], - ['fp_5fcorrectly_5frounded_5fdivide_5fsqrt_478',['FP_CORRECTLY_ROUNDED_DIVIDE_SQRT',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4a071561c3c0c8008d94c62067088f5df7',1,'cv::ocl::Device']]], - ['fp_5fdenorm_479',['FP_DENORM',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4a60dc18c71389d33555c840d0bfc46f10',1,'cv::ocl::Device']]], - ['fp_5ffma_480',['FP_FMA',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4adeae6e772e7eb469f70c8ea6f4f0b6cf',1,'cv::ocl::Device']]], - ['fp_5finf_5fnan_481',['FP_INF_NAN',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4ad66d4ef5c3c99381ae528f7c50ee473a',1,'cv::ocl::Device']]], - ['fp_5fround_5fto_5finf_482',['FP_ROUND_TO_INF',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4a5333014b1113e6e6d3b98f66dc92680f',1,'cv::ocl::Device']]], - ['fp_5fround_5fto_5fnearest_483',['FP_ROUND_TO_NEAREST',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4a08c33555a63c5b7c57ba870582ef94e3',1,'cv::ocl::Device']]], - ['fp_5fround_5fto_5fzero_484',['FP_ROUND_TO_ZERO',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4acb9e624465310714bc00a1aad1e788d7',1,'cv::ocl::Device']]], - ['fp_5fsoft_5ffloat_485',['FP_SOFT_FLOAT',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4a7731143130a6c1455b6d8207c9bbd92b',1,'cv::ocl::Device']]], - ['fpos_486',['fpos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html',1,'std::fpos< _StateT >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a6816aa318c7eeb099c78a3414a2bcdfd',1,'std::fpos::fpos()']]], - ['fps_487',['fps',['https://docs.opencv.org/4.2.0/d3/dad/structcv_1_1datasets_1_1GR__chalearnObj.html#a8567f2981a5a63a3214b4375f83e37ca',1,'cv::datasets::GR_chalearnObj::fps'],['https://docs.opencv.org/4.2.0/da/d0b/classcv_1_1videostab_1_1VideoFileSource.html#a61c733af4e06a8e80cbf7c3d39164719',1,'cv::videostab::VideoFileSource::fps()']]], - ['fr_5fadience_488',['FR_adience',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1datasets_1_1FR__adience.html',1,'cv::datasets']]], - ['fr_5fadience_2ehpp_489',['fr_adience.hpp',['https://docs.opencv.org/4.2.0/d5/d32/fr__adience_8hpp.html',1,'']]], - ['fr_5fadienceobj_490',['FR_adienceObj',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html',1,'cv::datasets']]], - ['fr_5flfw_491',['FR_lfw',['https://docs.opencv.org/4.2.0/dd/dda/classcv_1_1datasets_1_1FR__lfw.html',1,'cv::datasets']]], - ['fr_5flfw_2ehpp_492',['fr_lfw.hpp',['https://docs.opencv.org/4.2.0/d4/d13/fr__lfw_8hpp.html',1,'']]], - ['fr_5flfwobj_493',['FR_lfwObj',['https://docs.opencv.org/4.2.0/d9/d2d/structcv_1_1datasets_1_1FR__lfwObj.html',1,'cv::datasets']]], - ['frac_5fdigits_494',['frac_digits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ab087ab658475c890a25a4f2f564eb7ac',1,'std::moneypunct::frac_digits()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ab087ab658475c890a25a4f2f564eb7ac',1,'std::moneypunct_byname::frac_digits()']]], - ['frame_5fidx_495',['frame_idx',['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#aa5b2b1da715c62730a93bd620a30f569',1,'cv::tbm::TrackedObject']]], - ['frame_5fiterator_496',['frame_iterator',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a0986d6317590c33f1b45e669d02d112b',1,'cv']]], - ['frame_5flist_497',['frame_list',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a3fb9078b88bc768c9ac355e3aaebefb1',1,'cv']]], - ['frame_5fsource_2ehpp_498',['frame_source.hpp',['https://docs.opencv.org/4.2.0/df/da4/frame__source_8hpp.html',1,'']]], - ['framecount_499',['frameCount',['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a1effe095a8bc269e2b6b3520f7c47cfb',1,'cv::videostab::WobbleSuppressorBase']]], - ['framecount_5f_500',['frameCount_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a97ba722224a9aebef85fc52f96ff40b5',1,'cv::videostab::TwoPassStabilizer::frameCount_'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a7116eafeb9dd8c996d26f939ce8eddbe',1,'cv::videostab::WobbleSuppressorBase::frameCount_']]], - ['framecounter_501',['frameCounter',['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a4900788197a062ea1a2b0f05595238cd',1,'cv::datasets::TRACK_alov::frameCounter'],['https://docs.opencv.org/4.2.0/dc/d52/classcv_1_1datasets_1_1TRACK__vot.html#afb4e847b90c29bf48205c385ecf2bbb9',1,'cv::datasets::TRACK_vot::frameCounter']]], - ['framemask_5f_502',['frameMask_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a6c0c928aba126ee1e82d99854c6802c4',1,'cv::videostab::StabilizerBase']]], - ['frames_503',['FRAMES',['https://docs.opencv.org/4.2.0/d0/da3/classcv_1_1viz_1_1WTrajectory.html#af448f4e56e68f9d7e1bd1a2c5fce691fab1fc57306f5e30904ab69133004ddcef',1,'cv::viz::WTrajectory']]], - ['frames_504',['frames',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a0b8c5dc2943fa470f8e2c5258887d152',1,'cv::videostab::DeblurerBase::frames()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a6333e5af269fefdff2cd0da105f6293d',1,'cv::videostab::InpainterBase::frames()']]], - ['frames_5f_505',['frames_',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a7829afbbb7562c05a76fb2902e199975',1,'cv::videostab::DeblurerBase::frames_'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#adc5085073fa501e61d8edfe5a34975c4',1,'cv::videostab::InpainterBase::frames_'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a1ea7895d1ad39d39fcea5e96a1bffa50',1,'cv::videostab::StabilizerBase::frames_']]], - ['framesize_506',['frameSize',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#aa7dc6835d7baeef8dc8d1c31f7e689d5',1,'cv::dynafu::Params::frameSize'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#aff95e7ffb345076e610feb73bd7e24e8',1,'cv::kinfu::Params::frameSize'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a3222a19973164afc9e804e3c01f181a5',1,'cv::videostab::LpMotionStabilizer::frameSize()']]], - ['framesize_5f_507',['frameSize_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ac8532a295a5e7984095b44ceace4ea41',1,'cv::videostab::StabilizerBase']]], - ['framesource_508',['FrameSource',['https://docs.opencv.org/4.2.0/d4/dd6/classcv_1_1superres_1_1FrameSource.html',1,'cv::superres']]], - ['framesource_509',['frameSource',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a46172358a436b6e184626d8c67ba0d17',1,'cv::videostab::StabilizerBase']]], - ['framesource_5f_510',['frameSource_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a7ffe51bcff9eeb916f0b153e206bf604',1,'cv::videostab::StabilizerBase']]], - ['framework_511',['Framework',['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html',1,'2D Features Framework'],['https://docs.opencv.org/4.2.0/d1/db4/group__xfeatures2d.html',1,'Extra 2D Features Framework']]], - ['framework_512',['G-API framework',['https://docs.opencv.org/4.2.0/d7/d0d/group__gapi.html',1,'']]], - ['framework_20feature2d_20module_513',['2D Features framework (feature2d module)',['https://docs.opencv.org/4.2.0/d9/d97/tutorial_table_of_content_features2d.html',1,'']]], - ['framework_20for_20working_20with_20different_20datasets_514',['Framework for working with different datasets',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html',1,'']]], - ['framework_20models_515',['Load Caffe framework models',['https://docs.opencv.org/4.2.0/d5/de7/tutorial_dnn_googlenet.html',1,'']]], - ['freak_516',['FREAK',['https://docs.opencv.org/4.2.0/df/db4/classcv_1_1xfeatures2d_1_1FREAK.html',1,'cv::xfeatures2d']]], - ['free_517',['free',['https://docs.opencv.org/4.2.0/df/d98/classcv_1_1cuda_1_1GpuMat_1_1Allocator.html#afa6bd8ff6f7c002976bbb189950625fa',1,'cv::cuda::GpuMat::Allocator']]], - ['free_202d_20features_20algorithms_518',['Non-free 2D Features Algorithms',['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html',1,'']]], - ['free_20solvers_519',['Matrix-free solvers',['https://eigen.tuxfamily.org/dox/group__MatrixfreeSolverExample.html',1,'']]], - ['free_5fcoef_520',['free_coef',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a56f6acc89453e032e34ed32cef8ba8ce',1,'cv::HOGDescriptor']]], - ['free_5flist_521',['free_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10287.html',1,'__gnu_cxx']]], - ['freeallreservedbuffers_522',['freeAllReservedBuffers',['https://docs.opencv.org/4.2.0/d4/dad/classcv_1_1BufferPoolController.html#a431aef2a415a02bf878a803247232151',1,'cv::BufferPoolController']]], - ['freelist_523',['freeList',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#ac3fd8d1d9f1c3d7d4124ec8677cbd128',1,'cv::SparseMat::Hdr']]], - ['freememory_524',['freeMemory',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#aa2f2efc92ad5f6bd1291a72293886dca',1,'cv::cuda::DeviceInfo']]], - ['freepoint_525',['freePoint',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a961a50c070ec1db71efcadb6a9a95cff',1,'cv::Subdiv2D']]], - ['freeqedge_526',['freeQEdge',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a6253d11fc0bcd400221d1735f8c1d283',1,'cv::Subdiv2D']]], - ['freetype_20harfbuzz_527',['Drawing UTF-8 strings with freetype/harfbuzz',['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html',1,'']]], - ['freetype_2ehpp_528',['freetype.hpp',['https://docs.opencv.org/4.2.0/dc/d8f/freetype_8hpp.html',1,'']]], - ['freetype2_529',['FreeType2',['https://docs.opencv.org/4.2.0/d9/dfa/classcv_1_1freetype_1_1FreeType2.html',1,'cv::freetype']]], - ['freetype_5ffont_530',['freetype_font',['https://docs.opencv.org/4.2.0/d6/d08/structcv_1_1gapi_1_1wip_1_1draw_1_1freetype__font.html',1,'cv::gapi::wip::draw']]], - ['freezestr_531',['freezeStr',['../namespaceutil.html#a44747fa29acced278a3a6cc7335a5698',1,'util']]], - ['frequently_20asked_20questions_532',['Frequently Asked Questions',['https://docs.opencv.org/4.2.0/d3/d2d/faq.html',1,'']]], - ['from_533',['from',['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html#ac4e43b1421e87ba73232f9d502925b49',1,'cv::detail::GraphEdge']]], - ['from_20an_20image_534',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], - ['from_20eigen_535',['from Eigen',['https://eigen.tuxfamily.org/dox/TopicUsingBlasLapack.html',1,'Using BLAS/LAPACK from Eigen'],['https://eigen.tuxfamily.org/dox/TopicUsingIntelMKL.html',1,'Using Intel® MKL from Eigen']]], - ['from_20matrix_536',['Inheriting from Matrix',['https://eigen.tuxfamily.org/dox/TopicCustomizing_InheritingMatrix.html',1,'']]], - ['from_20motion_537',['From Motion',['https://docs.opencv.org/4.2.0/d8/d8c/group__sfm.html',1,'Structure From Motion'],['https://docs.opencv.org/4.2.0/de/d7c/tutorial_table_of_content_sfm.html',1,'Structure From Motion']]], - ['from_20one_20color_20space_20to_20another_538',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], - ['from_20other_20doxygen_20projects_539',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], - ['from_20stereo_20images_540',['Depth Map from Stereo Images',['https://docs.opencv.org/4.2.0/dd/d53/tutorial_py_depthmap.html',1,'']]], - ['from_5fbson_541',['from_bson',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4e02793f2691aa29ab7cb69fddafbf5c.html#a4e02793f2691aa29ab7cb69fddafbf5c',1,'nlohmann::basic_json::from_bson(InputType &&i, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4118d0ec23d9eeafc236b9524d220e94.html#a4118d0ec23d9eeafc236b9524d220e94',1,'nlohmann::basic_json::from_bson(IteratorType first, IteratorType last, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ae2612581e4788ddffc2f45d5e4cc04fc.html#ae2612581e4788ddffc2f45d5e4cc04fc',1,'nlohmann::basic_json::from_bson(const T *ptr, std::size_t len, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a2afe89884edf72412a0624982324755d.html#a2afe89884edf72412a0624982324755d',1,'nlohmann::basic_json::from_bson(detail::span_input_adapter &&i, const bool strict=true, const bool allow_exceptions=true)']]], - ['from_5fbytes_542',['from_bytes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a5adef5a1030829016c2afe669a5d335f',1,'std::wstring_convert::from_bytes(char __byte)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#abd8e388d1f5e74cfaf824f8971bfb6dd',1,'std::wstring_convert::from_bytes(const char *__ptr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#af35796c796e1d9df713e0dd9fafea066',1,'std::wstring_convert::from_bytes(const byte_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#ab1176fe15be7975d9e57184c8d8d7e3e',1,'std::wstring_convert::from_bytes(const char *__first, const char *__last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a5adef5a1030829016c2afe669a5d335f',1,'std::wstring_convert::from_bytes(char __byte)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#abd8e388d1f5e74cfaf824f8971bfb6dd',1,'std::wstring_convert::from_bytes(const char *__ptr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#af35796c796e1d9df713e0dd9fafea066',1,'std::wstring_convert::from_bytes(const byte_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#ab1176fe15be7975d9e57184c8d8d7e3e',1,'std::wstring_convert::from_bytes(const char *__first, const char *__last)']]], - ['from_5fcbor_543',['from_cbor',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a44dd5635fb2da4710f6cd6e42b72773f.html#a44dd5635fb2da4710f6cd6e42b72773f',1,'nlohmann::basic_json::from_cbor(InputType &&i, const bool strict=true, const bool allow_exceptions=true, const cbor_tag_handler_t tag_handler=cbor_tag_handler_t::error)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aba4f6fc79cc405fb212ea3d992334e71.html#aba4f6fc79cc405fb212ea3d992334e71',1,'nlohmann::basic_json::from_cbor(IteratorType first, IteratorType last, const bool strict=true, const bool allow_exceptions=true, const cbor_tag_handler_t tag_handler=cbor_tag_handler_t::error)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a188755c8cda27e2afb03c016c14125d8.html#a188755c8cda27e2afb03c016c14125d8',1,'nlohmann::basic_json::from_cbor(const T *ptr, std::size_t len, const bool strict=true, const bool allow_exceptions=true, const cbor_tag_handler_t tag_handler=cbor_tag_handler_t::error)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4a67e47f4bcde55214475f47f8314c1f.html#a4a67e47f4bcde55214475f47f8314c1f',1,'nlohmann::basic_json::from_cbor(detail::span_input_adapter &&i, const bool strict=true, const bool allow_exceptions=true, const cbor_tag_handler_t tag_handler=cbor_tag_handler_t::error)']]], - ['from_5fjson_544',['from_json',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1adl__serializer_abdae6028cdef1bf1838b47eeb7022ebc.html#abdae6028cdef1bf1838b47eeb7022ebc',1,'nlohmann::adl_serializer::from_json(BasicJsonType &&j) noexcept(noexcept(::nlohmann::from_json(std::forward< BasicJsonType >(j), detail::identity_tag< TargetType > {}))) -> decltype(::nlohmann::from_json(std::forward< BasicJsonType >(j), detail::identity_tag< TargetType > {}))'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1adl__serializer_a8180f52bf21fc610705bc521f22116ae.html#a8180f52bf21fc610705bc521f22116ae',1,'nlohmann::adl_serializer::from_json(BasicJsonType &&j, TargetType &val) noexcept(noexcept(::nlohmann::from_json(std::forward< BasicJsonType >(j), val))) -> decltype(::nlohmann::from_json(std::forward< BasicJsonType >(j), val), void())'],['https://nlohmann.github.io/json/doxygen/namespacenlohmann_1_1anonymous__namespace_02json_8hpp_03_a69afe041fa2aeac2239b65ae88b64af8.html#a69afe041fa2aeac2239b65ae88b64af8',1,'nlohmann::anonymous_namespace{json.hpp}::from_json']]], - ['from_5fmsgpack_545',['from_msgpack',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_adbcab52fca1e25b3311ef14e71a57590.html#adbcab52fca1e25b3311ef14e71a57590',1,'nlohmann::basic_json::from_msgpack(InputType &&i, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a94dbeb08bcd13821512957dcbf3f00bd.html#a94dbeb08bcd13821512957dcbf3f00bd',1,'nlohmann::basic_json::from_msgpack(IteratorType first, IteratorType last, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0d69d3102639759d5202a6f764760d23.html#a0d69d3102639759d5202a6f764760d23',1,'nlohmann::basic_json::from_msgpack(const T *ptr, std::size_t len, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a84b3d89de8e774a2609dc4c0a1273f62.html#a84b3d89de8e774a2609dc4c0a1273f62',1,'nlohmann::basic_json::from_msgpack(detail::span_input_adapter &&i, const bool strict=true, const bool allow_exceptions=true)']]], - ['from_5fubjson_546',['from_ubjson',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa81f62db69978b90ff701f05c72e03a7.html#aa81f62db69978b90ff701f05c72e03a7',1,'nlohmann::basic_json::from_ubjson(InputType &&i, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9dbb422350fed520ce8c1ca8762c0251.html#a9dbb422350fed520ce8c1ca8762c0251',1,'nlohmann::basic_json::from_ubjson(IteratorType first, IteratorType last, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab6eeda23c34cee79d8d72f1a8691a8de.html#ab6eeda23c34cee79d8d72f1a8691a8de',1,'nlohmann::basic_json::from_ubjson(const T *ptr, std::size_t len, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a47201396899371881a46562bffb922da.html#a47201396899371881a46562bffb922da',1,'nlohmann::basic_json::from_ubjson(detail::span_input_adapter &&i, const bool strict=true, const bool allow_exceptions=true)']]], - ['frombinary_547',['fromBinary',['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a221c9df82bf2af3b61fd85925a0862ba',1,'cv::ocl::ProgramSource']]], - ['frombits_548',['fromBits',['https://docs.opencv.org/4.2.0/df/dc9/classcv_1_1float16__t.html#a634a5a8e4f62a8786f7218ee32edd30a',1,'cv::float16_t']]], - ['fromfilemotionreader_549',['FromFileMotionReader',['https://docs.opencv.org/4.2.0/d9/db3/classcv_1_1videostab_1_1FromFileMotionReader.html',1,'cv::videostab::FromFileMotionReader'],['https://docs.opencv.org/4.2.0/d9/db3/classcv_1_1videostab_1_1FromFileMotionReader.html#a1570812c6ce274afca6520d62ed2ac34',1,'cv::videostab::FromFileMotionReader::FromFileMotionReader()']]], - ['fromplyfile_550',['fromPlyFile',['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#a0bd62dc76ad1604c16752e4907f55fdb',1,'cv::viz::Widget']]], - ['frompositionorientationscale_551',['fromPositionOrientationScale',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#afac1e7bd782e5cc92cbf70128809d5d1',1,'Eigen::Transform']]], - ['fromraw_552',['fromRaw',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf69ed94a5e5dd2499598eeedcd655f68',1,'cv::softdouble::fromRaw()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaec5706db4303cd7c812996d810288440',1,'cv::softfloat::fromRaw()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaec5706db4303cd7c812996d810288440',1,'fromRaw(const uint32_t a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf69ed94a5e5dd2499598eeedcd655f68',1,'fromRaw(const uint64_t a)(Global Namespace)']]], - ['fromrotationmatrix_553',['fromRotationMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a2e35689645f69ba886df1a0a14b76ffe',1,'Eigen::AngleAxis::fromRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a3e00ee4d983879c32d615b2a7153a26d',1,'Eigen::Rotation2D::fromRotationMatrix()']]], - ['fromspir_554',['fromSPIR',['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a264ddbcfeb541ceed587ea52291b3a0c',1,'cv::ocl::ProgramSource']]], - ['fromtwovectors_555',['FromTwoVectors',['https://eigen.tuxfamily.org/dox/classEigen_1_1Quaternion.html#acdb1eb44eb733b24749bc7892badde64',1,'Eigen::Quaternion']]], - ['front_556',['front',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae5b6f85c316a0f9007f76047ad424a4b',1,'__gnu_cxx::__versa_string::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2d530a251f3c1e3d9e1b6163bda94df8',1,'__gnu_cxx::__versa_string::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'__gnu_debug::basic_string::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'__gnu_debug::basic_string::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< _CharT >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< _CharT >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< _CharT, _Traits, _Allocator >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< _CharT, _Traits, _Allocator >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< char >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< char >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< char, char_traits< char >, _Byte_alloc >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< char, char_traits< char >, _Byte_alloc >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< char_type, _Traits, _Alloc >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< char_type, _Traits, _Alloc >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< value_type >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< value_type >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ae5172d8f3ab8a44f5f68f5d6256e5c7e',1,'deque< _StateSeqT >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a62222a6cab13f17c0489a3d6242dd6a8',1,'deque< _StateSeqT >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad4367625f1676f2fc0d56b891db683fe',1,'list< __inp, __rebind_inp >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a5393c199d92f965d065b677f2230e51e',1,'list< __inp, __rebind_inp >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'match_results< _Bi_iter >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'match_results< _Bi_iter >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'std::basic_string::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'std::basic_string::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ae5172d8f3ab8a44f5f68f5d6256e5c7e',1,'std::deque::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a62222a6cab13f17c0489a3d6242dd6a8',1,'std::deque::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aa2daca181da8d9a22ecc19e4a7364b1f',1,'std::forward_list::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a40c8314a3fb6d46884588bcab67111b5',1,'std::forward_list::front() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad4367625f1676f2fc0d56b891db683fe',1,'std::list::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a5393c199d92f965d065b677f2230e51e',1,'std::list::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'std::match_results::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'std::match_results::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#a4a2ec140f75225a04b64572f4b914331',1,'std::queue::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#ac18027278a15d097de21b0bca5bcce40',1,'std::queue::front() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'std::vector::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'std::vector::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< __diff_type >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< __diff_type >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _CharClassT >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _CharClassT >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _CharT >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _CharT >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _Cmpt >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _Cmpt >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _Node *, _Nodeptr_Alloc >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _Node *, _Nodeptr_Alloc >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _RealType >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _RealType >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _State< _TraitsT::char_type > >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _State< _TraitsT::char_type > >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _StringT >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _StringT >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< block_type, allocator_type >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< block_type, allocator_type >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< Catalog_info * >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< Catalog_info * >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< double >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< double >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< int >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< int >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< result_type >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< result_type >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< size_t >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< size_t >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< std::pair< _BiIter, int > >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< std::pair< _BiIter, int > >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< std::pair< _StateIdT, std::vector > >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< std::pair< _StateIdT, std::vector > >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< std::pair< _StrTransT, _StrTransT > >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< std::pair< _StrTransT, _StrTransT > >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< sub_match< _Bi_iter >, _Alloc >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< sub_match< _Bi_iter >, _Alloc >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< sub_match< _BiIter >, _Alloc >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< sub_match< _BiIter >, _Alloc >::front() const noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5417ca43ae5e7a3a2f82eee2d915c6ed.html#a5417ca43ae5e7a3a2f82eee2d915c6ed',1,'nlohmann::basic_json::front()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5ac8f974c178cf9326b6765e22f50eb6.html#a5ac8f974c178cf9326b6765e22f50eb6',1,'nlohmann::basic_json::front() const']]], - ['front_5finsert_5fiterator_557',['front_insert_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html',1,'std::front_insert_iterator< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#af9af46e110258e56e4b6eb8a8b8d92c2',1,'std::front_insert_iterator::front_insert_iterator()']]], - ['front_5finserter_558',['front_inserter',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga3042ef36dac917905beccc35389af1cb',1,'std::front_inserter()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga3042ef36dac917905beccc35389af1cb',1,'front_inserter()(Global Namespace)']]], - ['fs_559',['fs',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a38cdd4298f4b76283b777c2b6b8369bb',1,'cv::FileNode::fs'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ad19a4d5591eaacf5608818f796cf02e4',1,'cv::FileNodeIterator::fs'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a8b175b4fad1f28da380f4487ee943db2',1,'cv::gapi::wip::draw::Text::fs']]], - ['fsr_5ffor_5finpainting_2emarkdown_560',['fsr_for_inpainting.markdown',['https://docs.opencv.org/4.2.0/d6/d01/fsr__for__inpainting_8markdown.html',1,'']]], - ['fstream_561',['fstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00068.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gabafb787f1b4ab7d00c500cefb554f632',1,'std::fstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gabafb787f1b4ab7d00c500cefb554f632',1,'fstream(Global Namespace)']]], - ['fstream_2etcc_562',['fstream.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00356.html',1,'']]], - ['ft02d_5fcomponents_563',['FT02D_components',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga2e6f8833aa72454850665baf7a583229',1,'cv::ft::FT02D_components()'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga2e6f8833aa72454850665baf7a583229',1,'FT02D_components()(Global Namespace)']]], - ['ft02d_5ffl_5fprocess_564',['FT02D_FL_process',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga55a31d93a56ff0713cb466b4c39f3b6f',1,'cv::ft::FT02D_FL_process()'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga55a31d93a56ff0713cb466b4c39f3b6f',1,'FT02D_FL_process()(Global Namespace)']]], - ['ft02d_5ffl_5fprocess_5ffloat_565',['FT02D_FL_process_float',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#gafc5685ee620a0b397c1b86c3fc82bd39',1,'cv::ft::FT02D_FL_process_float()'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#gafc5685ee620a0b397c1b86c3fc82bd39',1,'FT02D_FL_process_float()(Global Namespace)']]], - ['ft02d_5finverseft_566',['FT02D_inverseFT',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga03b14c805fcdfbb3f1b23e1ab4d1e12c',1,'cv::ft::FT02D_inverseFT()'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga03b14c805fcdfbb3f1b23e1ab4d1e12c',1,'FT02D_inverseFT()(Global Namespace)']]], - ['ft02d_5fiteration_567',['FT02D_iteration',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga03c0e714c646c6d0394ae0eb2c2ae2a3',1,'cv::ft::FT02D_iteration()'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga03c0e714c646c6d0394ae0eb2c2ae2a3',1,'FT02D_iteration()(Global Namespace)']]], - ['ft02d_5fprocess_568',['FT02D_process',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#gab672419d3deead8602de611537099288',1,'cv::ft::FT02D_process()'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#gab672419d3deead8602de611537099288',1,'FT02D_process()(Global Namespace)']]], - ['ft12d_5fcomponents_569',['FT12D_components',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga7d6d0321a9914d3796a1e3b9fc68a495',1,'cv::ft::FT12D_components()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga7d6d0321a9914d3796a1e3b9fc68a495',1,'FT12D_components()(Global Namespace)']]], - ['ft12d_5fcreatepolynommatrixhorizontal_570',['FT12D_createPolynomMatrixHorizontal',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga4cdc8614be18fd950b6da114168391b5',1,'cv::ft::FT12D_createPolynomMatrixHorizontal()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga4cdc8614be18fd950b6da114168391b5',1,'FT12D_createPolynomMatrixHorizontal()(Global Namespace)']]], - ['ft12d_5fcreatepolynommatrixvertical_571',['FT12D_createPolynomMatrixVertical',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#gae14b96c862f6c1b1f13cce03a95e3e2d',1,'cv::ft::FT12D_createPolynomMatrixVertical()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#gae14b96c862f6c1b1f13cce03a95e3e2d',1,'FT12D_createPolynomMatrixVertical()(Global Namespace)']]], - ['ft12d_5finverseft_572',['FT12D_inverseFT',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga42960e3dedc53cb7a2b210e21d0c71a2',1,'cv::ft::FT12D_inverseFT()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga42960e3dedc53cb7a2b210e21d0c71a2',1,'FT12D_inverseFT()(Global Namespace)']]], - ['ft12d_5fpolynomial_573',['FT12D_polynomial',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga3ac09befbc2b08c59cc9a60dbe3fdcca',1,'cv::ft::FT12D_polynomial()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga3ac09befbc2b08c59cc9a60dbe3fdcca',1,'FT12D_polynomial()(Global Namespace)']]], - ['ft12d_5fprocess_574',['FT12D_process',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga7a49b37ec6f442427b9a3ef4842189dd',1,'cv::ft::FT12D_process()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga7a49b37ec6f442427b9a3ef4842189dd',1,'FT12D_process()(Global Namespace)']]], - ['ftext_575',['FText',['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html',1,'cv::gapi::wip::draw::FText'],['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#aefc774a9d79c312a0057797220b247b2',1,'cv::gapi::wip::draw::FText::FText()']]], - ['ftp_576',['FTP',['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html#gga06e837be12dab197606d1155a8b94025a4652f36554cab9ec596798cdb98aa1c7',1,'cv::structured_light::FTP'],['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html#gga06e837be12dab197606d1155a8b94025a4652f36554cab9ec596798cdb98aa1c7',1,'FTP(Global Namespace)']]], - ['full_5faffine_5f_577',['full_affine_',['https://docs.opencv.org/4.2.0/d3/dda/classcv_1_1detail_1_1AffineBestOf2NearestMatcher.html#a3f40f14058ad648e529ec1c2952d9519',1,'cv::detail::AffineBestOf2NearestMatcher']]], - ['full_5fuv_578',['FULL_UV',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a4700f5207e66cdd9924bf64e34911832a312212af9fa27d5560981e24f845434a',1,'cv::SVD']]], - ['fullpivhouseholderqr_579',['FullPivHouseholderQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html',1,'Eigen']]], - ['fullpivhouseholderqr_580',['fullPivHouseholderQr',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a863bc0e06b641a089508eabec6835ab2',1,'Eigen::MatrixBase::fullPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a863bc0e06b641a089508eabec6835ab2',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::fullPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a863bc0e06b641a089508eabec6835ab2',1,'MatrixBase< Solve< Decomposition, RhsType > >::fullPivHouseholderQr()']]], - ['fullpivhouseholderqr_581',['FullPivHouseholderQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aeb14b4c1eef33128207b40a00bd0bd08',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aeeace3abca6b215025e94c3e098b0a97',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#ac9bdb4f7fa77c1aa16f238592c248e70',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#abf722e1dc7241a5d6f76460ef0c87821',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR(Index rows, Index cols)']]], - ['fullpivhouseholderqrpreconditioner_582',['FullPivHouseholderQRPreconditioner',['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56eabd745dcaff7019c5f918c68809e5ea50',1,'Eigen::FullPivHouseholderQRPreconditioner'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56eabd745dcaff7019c5f918c68809e5ea50',1,'FullPivHouseholderQRPreconditioner(Global Namespace)']]], - ['fullpivlu_583',['FullPivLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html',1,'Eigen']]], - ['fullpivlu_584',['fullPivLu',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a25da97d31acab0ee5d9d13bdbb0569da',1,'Eigen::MatrixBase::fullPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a25da97d31acab0ee5d9d13bdbb0569da',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::fullPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a25da97d31acab0ee5d9d13bdbb0569da',1,'MatrixBase< Solve< Decomposition, RhsType > >::fullPivLu()']]], - ['fullpivlu_585',['FullPivLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#af225528d1c6e623a2b1dce091907d13e',1,'Eigen::FullPivLU::FullPivLU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a31a6a984478a9f721f367667fe4c5ab1',1,'Eigen::FullPivLU::FullPivLU(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a3e903b9f401e3fc5d1ca7c6951c76185',1,'Eigen::FullPivLU::FullPivLU(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#ae83ebd2a24088f04e3ac835b0dc001e1',1,'Eigen::FullPivLU::FullPivLU(Index rows, Index cols)']]], - ['func_586',['func',['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a5436ea62554761441ed4ce03938b49c1',1,'cv::Exception']]], - ['funcattrib_2ehpp_587',['funcattrib.hpp',['https://docs.opencv.org/4.2.0/db/dbc/funcattrib_8hpp.html',1,'']]], - ['functexcept_2eh_588',['functexcept.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00359.html',1,'']]], - ['function_589',['Function',['https://docs.opencv.org/4.2.0/da/d62/classcv_1_1MinProblemSolver_1_1Function.html',1,'cv::MinProblemSolver']]], - ['function_590',['function',['https://docs.opencv.org/4.2.0/d4/dd9/structcvv_1_1impl_1_1CallMetaData.html#ae56c8ab539e5a2e7ab0dc2b07eff5613',1,'cvv::impl::CallMetaData::function'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#aabc5bfd9d463ca6a06aa8198a1f12e14',1,'std::function< _Res(_ArgTypes...)>::function() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a4a3d52a1f71572613d699d0593479615',1,'std::function< _Res(_ArgTypes...)>::function(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a8869fed86e489fcedbf59cd814f440b3',1,'std::function< _Res(_ArgTypes...)>::function(const function &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a91f39c85ac536220f5efd7e505fc73e6',1,'std::function< _Res(_ArgTypes...)>::function(function &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a8c5a08fdc36581c53fa597667322cf7d',1,'std::function< _Res(_ArgTypes...)>::function(_Functor)']]], - ['function_20for_20mat_20data_591',['Plot function for Mat data',['https://docs.opencv.org/4.2.0/db/dfe/group__plot.html',1,'']]], - ['function_20objects_592',['Function Objects',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html',1,'']]], - ['function_20of_20keypoints_20and_20matches_593',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], - ['function_3c_20_5fres_28_5fargtypes_2e_2e_2e_29_3e_594',['function< _Res(_ArgTypes...)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html',1,'std']]], - ['functional_595',['functional',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00071.html',1,'']]], - ['functional_2ehpp_596',['functional.hpp',['https://docs.opencv.org/4.2.0/d7/dfd/modules_2core_2include_2opencv2_2core_2cuda_2functional_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d4b/contrib_2modules_2cudev_2include_2opencv2_2cudev_2functional_2functional_8hpp.html',1,'(Global Namespace)']]], - ['functional_5fhash_2eh_597',['functional_hash.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00362.html',1,'']]], - ['functionality_598',['functionality',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html',1,'Core functionality'],['https://docs.opencv.org/4.2.0/df/d1f/group__gapi__core.html',1,'G-API Core functionality'],['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'G-API Drawing and composition functionality'],['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'G-API Image processing functionality']]], - ['functionality_20core_20module_599',['The Core Functionality (core module)',['https://docs.opencv.org/4.2.0/de/d7a/tutorial_table_of_content_core.html',1,'']]], - ['functions_600',['functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html',1,'Adaptors for pointers to functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01523.html',1,'Array creation functions'],['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'Catalog of coefficient-wise math functions']]], - ['functions_601',['Functions',['https://docs.opencv.org/4.2.0/d5/d45/tutorial_py_contours_more_functions.html',1,'Contours : More Functions'],['https://docs.opencv.org/4.2.0/d8/d1c/tutorial_js_contours_more_functions.html',1,'Contours : More Functions'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html',1,'Drawing Functions']]], - ['functions_602',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], - ['functions_603',['Functions',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html',1,'Functions'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html',1,'Functions']]], - ['functions_604',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], - ['functions_605',['Functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html',1,'Mathematical Special Functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html',1,'Mathematical Special Functions']]], - ['functions_606',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], - ['functions_607',['Qt New Functions',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html',1,'']]], - ['functions_20and_20macros_608',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], - ['functions_20for_20opencv_20samples_609',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]], - ['functions_20in_20opencv_610',['Drawing Functions in OpenCV',['https://docs.opencv.org/4.2.0/dc/da5/tutorial_py_drawing_functions.html',1,'']]], - ['functions_20taking_20eigen_20types_20as_20parameters_611',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], - ['functions_2eh_612',['functions.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00758.html',1,'']]], - ['functor_613',['functor',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseBinaryOp.html#adfb40100689f5e13be1786db5d7fecbf',1,'Eigen::CwiseBinaryOp::functor()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseNullaryOp.html#afef9c2479e357786e4c92da1aa625248',1,'Eigen::CwiseNullaryOp::functor()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseTernaryOp.html#a9009f896ee1103c8f28a748e59f12b9a',1,'Eigen::CwiseTernaryOp::functor()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseUnaryOp.html#aa70041dd94ec46f330cf19a06425d172',1,'Eigen::CwiseUnaryOp::functor()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseUnaryView.html#af01271cdadcbcf195b5d3130ff2e1a48',1,'Eigen::CwiseUnaryView::functor()']]], - ['fundamental_614',['Fundamental',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html',1,'']]], - ['fundamental_2ehpp_615',['fundamental.hpp',['https://docs.opencv.org/4.2.0/d4/db1/fundamental_8hpp.html',1,'']]], - ['fundamentalfromcorrespondences7pointrobust_616',['fundamentalFromCorrespondences7PointRobust',['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html#ga1d908603423af0d26be144fd233067c1',1,'cv::sfm::fundamentalFromCorrespondences7PointRobust()'],['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html#ga1d908603423af0d26be144fd233067c1',1,'fundamentalFromCorrespondences7PointRobust()(Global Namespace)']]], - ['fundamentalfromcorrespondences8pointrobust_617',['fundamentalFromCorrespondences8PointRobust',['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html#ga1c4d5becbdd48f48547837e44e9b3e98',1,'cv::sfm::fundamentalFromCorrespondences8PointRobust()'],['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html#ga1c4d5becbdd48f48547837e44e9b3e98',1,'fundamentalFromCorrespondences8PointRobust()(Global Namespace)']]], - ['fundamentalfromessential_618',['fundamentalFromEssential',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaaac7556ce8ebb74b199d416a3e86861a',1,'cv::sfm::fundamentalFromEssential()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaaac7556ce8ebb74b199d416a3e86861a',1,'fundamentalFromEssential()(Global Namespace)']]], - ['fundamentalfromprojections_619',['fundamentalFromProjections',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga02efdf4480a63d680a5dada595a88aa8',1,'cv::sfm::fundamentalFromProjections()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga02efdf4480a63d680a5dada595a88aa8',1,'fundamentalFromProjections()(Global Namespace)']]], - ['future_620',['future',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02239.html',1,'std::future< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00074.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02239.html#a47c11429633480bddbb965a5f79ab410',1,'std::future::future()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02351.html#a290550ce931d18ccad7d296e4875ddb3',1,'std::future< _Res & >::future()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02355.html#a8d804ed9d3fb0818d7d4af8197cc00a7',1,'std::future< void >::future()']]], - ['future_3c_20_5fres_20_26_20_3e_621',['future< _Res & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02351.html',1,'std']]], - ['future_3c_20void_20_3e_622',['future< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02355.html',1,'std']]], - ['future_5falready_5fretrieved_623',['future_already_retrieved',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a829037befd349f04ff71ddea385bdb9a',1,'future_already_retrieved(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a829037befd349f04ff71ddea385bdb9a',1,'future_already_retrieved(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a829037befd349f04ff71ddea385bdb9a',1,'future_already_retrieved(Global Namespace)']]], - ['future_5fcategory_624',['future_category',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga5b4abfa468beb197d5bdac89e20afdb0',1,'std::future_category()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga5b4abfa468beb197d5bdac89e20afdb0',1,'future_category()(Global Namespace)']]], - ['future_5ferrc_625',['future_errc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6',1,'std::future_errc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6',1,'future_errc(Global Namespace)']]], - ['future_5ferror_626',['future_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02235.html',1,'std']]], - ['future_5fstatus_627',['future_status',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4',1,'std::future_status'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4',1,'future_status(Global Namespace)']]], - ['futures_628',['Futures',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html',1,'']]], - ['fuzzy_20image_20processing_629',['Fuzzy image processing',['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html',1,'']]], - ['fuzzy_20image_20processing_20tutorials_630',['Fuzzy image processing tutorials',['https://docs.opencv.org/4.2.0/d7/d36/tutorial_fuzzy.html',1,'']]], - ['fuzzy_20mathematics_631',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], - ['fuzzy_2ehpp_632',['fuzzy.hpp',['https://docs.opencv.org/4.2.0/df/dc0/fuzzy_8hpp.html',1,'']]], - ['fuzzy_2emarkdown_633',['fuzzy.markdown',['https://docs.opencv.org/4.2.0/de/d62/fuzzy_8markdown.html',1,'']]], - ['fuzzy_5ff0_5fmath_2ehpp_634',['fuzzy_F0_math.hpp',['https://docs.opencv.org/4.2.0/d1/d6d/fuzzy__F0__math_8hpp.html',1,'']]], - ['fuzzy_5ff1_5fmath_2ehpp_635',['fuzzy_F1_math.hpp',['https://docs.opencv.org/4.2.0/d2/d46/fuzzy__F1__math_8hpp.html',1,'']]], - ['fuzzy_5fimage_2ehpp_636',['fuzzy_image.hpp',['https://docs.opencv.org/4.2.0/d3/dba/fuzzy__image_8hpp.html',1,'']]], - ['fx_637',['fx',['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#a2504642a05f313ad0798b0745e9f1842',1,'cv::cudev::ResizePtr']]], - ['fy_638',['fy',['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#aba1db2738b76bb71b114ec3375ffcb7f',1,'cv::cudev::ResizePtr']]] + ['feature_20description_102',['Feature Description',['https://docs.opencv.org/4.2.0/d5/dde/tutorial_feature_description.html',1,'']]], + ['feature_20detection_103',['Feature Detection',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/d7/d66/tutorial_feature_detection.html',1,'Feature Detection']]], + ['feature_20detection_20and_20description_104',['Feature Detection and Description',['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/db/d27/tutorial_py_table_of_contents_feature2d.html',1,'Feature Detection and Description']]], + ['feature_20matching_105',['Feature Matching',['https://docs.opencv.org/4.2.0/dc/dc3/tutorial_py_matcher.html',1,'']]], + ['feature_20matching_20homography_20to_20find_20objects_106',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], + ['feature_20matching_20with_20flann_107',['Feature Matching with FLANN',['https://docs.opencv.org/4.2.0/d5/d6f/tutorial_feature_flann_matcher.html',1,'']]], + ['feature_20selection_20for_20efficient_20image_20segmentation_108',['Hierarchical Feature Selection for Efficient Image Segmentation',['https://docs.opencv.org/4.2.0/dc/d29/group__hfs.html',1,'']]], + ['feature_20transform_109',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], + ['feature_2ehpp_110',['feature.hpp',['https://docs.opencv.org/4.2.0/d4/d35/feature_8hpp.html',1,'']]], + ['feature2d_111',['Feature2D',['https://docs.opencv.org/4.2.0/d0/d13/classcv_1_1Feature2D.html',1,'cv']]], + ['feature2d_20module_112',['2D Features framework (feature2d module)',['https://docs.opencv.org/4.2.0/d9/d97/tutorial_table_of_content_features2d.html',1,'']]], + ['feature2dasync_113',['Feature2DAsync',['https://docs.opencv.org/4.2.0/df/db9/classcv_1_1cuda_1_1Feature2DAsync.html',1,'cv::cuda']]], + ['feature_5fdescription_2emarkdown_114',['feature_description.markdown',['https://docs.opencv.org/4.2.0/dc/d9f/feature__description_8markdown.html',1,'']]], + ['feature_5fdetection_2emarkdown_115',['feature_detection.markdown',['https://docs.opencv.org/4.2.0/d7/db5/feature__detection_8markdown.html',1,'']]], + ['feature_5fflann_5fmatcher_2emarkdown_116',['feature_flann_matcher.markdown',['https://docs.opencv.org/4.2.0/d9/d22/feature__flann__matcher_8markdown.html',1,'']]], + ['feature_5fhomography_2emarkdown_117',['feature_homography.markdown',['https://docs.opencv.org/4.2.0/d3/d0b/feature__homography_8markdown.html',1,'']]], + ['feature_5fset_5fcompute_5f10_118',['FEATURE_SET_COMPUTE_10',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ab34c101b8be1bfbf64fe53db6277639d',1,'cv::cuda::FEATURE_SET_COMPUTE_10'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ab34c101b8be1bfbf64fe53db6277639d',1,'FEATURE_SET_COMPUTE_10(Global Namespace)']]], + ['feature_5fset_5fcompute_5f11_119',['FEATURE_SET_COMPUTE_11',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a82461455d1a5663b49d55c4b21c6ff52',1,'cv::cuda::FEATURE_SET_COMPUTE_11'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a82461455d1a5663b49d55c4b21c6ff52',1,'FEATURE_SET_COMPUTE_11(Global Namespace)']]], + ['feature_5fset_5fcompute_5f12_120',['FEATURE_SET_COMPUTE_12',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0abe959647501a9c973592060723fe9d16',1,'cv::cuda::FEATURE_SET_COMPUTE_12'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0abe959647501a9c973592060723fe9d16',1,'FEATURE_SET_COMPUTE_12(Global Namespace)']]], + ['feature_5fset_5fcompute_5f13_121',['FEATURE_SET_COMPUTE_13',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ae1996d5cc9efd9d0db1edb987a6b88b0',1,'cv::cuda::FEATURE_SET_COMPUTE_13'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ae1996d5cc9efd9d0db1edb987a6b88b0',1,'FEATURE_SET_COMPUTE_13(Global Namespace)']]], + ['feature_5fset_5fcompute_5f20_122',['FEATURE_SET_COMPUTE_20',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ac3b86a55893548ec28d6360b38ef78cd',1,'cv::cuda::FEATURE_SET_COMPUTE_20'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ac3b86a55893548ec28d6360b38ef78cd',1,'FEATURE_SET_COMPUTE_20(Global Namespace)']]], + ['feature_5fset_5fcompute_5f21_123',['FEATURE_SET_COMPUTE_21',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ac46cbea580480b80f48f9a843b1fca98',1,'cv::cuda::FEATURE_SET_COMPUTE_21'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0ac46cbea580480b80f48f9a843b1fca98',1,'FEATURE_SET_COMPUTE_21(Global Namespace)']]], + ['feature_5fset_5fcompute_5f30_124',['FEATURE_SET_COMPUTE_30',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0aeb9eaa4b4a1be83d87212c4afad9bebb',1,'cv::cuda::FEATURE_SET_COMPUTE_30'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0aeb9eaa4b4a1be83d87212c4afad9bebb',1,'FEATURE_SET_COMPUTE_30(Global Namespace)']]], + ['feature_5fset_5fcompute_5f32_125',['FEATURE_SET_COMPUTE_32',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a965876faa336b34a95b781129915766d',1,'cv::cuda::FEATURE_SET_COMPUTE_32'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a965876faa336b34a95b781129915766d',1,'FEATURE_SET_COMPUTE_32(Global Namespace)']]], + ['feature_5fset_5fcompute_5f35_126',['FEATURE_SET_COMPUTE_35',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0acb28f583b1a1e680da03ef1363e96301',1,'cv::cuda::FEATURE_SET_COMPUTE_35'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0acb28f583b1a1e680da03ef1363e96301',1,'FEATURE_SET_COMPUTE_35(Global Namespace)']]], + ['feature_5fset_5fcompute_5f50_127',['FEATURE_SET_COMPUTE_50',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a4e7aa099ce8d9f1b4c26cb9755a17d11',1,'cv::cuda::FEATURE_SET_COMPUTE_50'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#gga776cf8e0301b18e19be4782754274fe0a4e7aa099ce8d9f1b4c26cb9755a17d11',1,'FEATURE_SET_COMPUTE_50(Global Namespace)']]], + ['feature_5fsize_128',['FEATURE_SIZE',['https://docs.opencv.org/4.2.0/d4/d6a/classcv_1_1cuda_1_1FastFeatureDetector.html#af613a7b713366233955c179c36c11765',1,'cv::cuda::FastFeatureDetector']]], + ['featuredetector_129',['FeatureDetector',['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#ga15e1361bda978d83a2bea629b32dfd3c',1,'cv::FeatureDetector'],['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html#ga15e1361bda978d83a2bea629b32dfd3c',1,'FeatureDetector(Global Namespace)']]], + ['featurehaar_130',['FeatureHaar',['https://docs.opencv.org/4.2.0/d3/d52/classcv_1_1CvHaarEvaluator_1_1FeatureHaar.html',1,'cv::CvHaarEvaluator::FeatureHaar'],['https://docs.opencv.org/4.2.0/d3/d52/classcv_1_1CvHaarEvaluator_1_1FeatureHaar.html#aaafa166f32d73efd668d4831e113e58d',1,'cv::CvHaarEvaluator::FeatureHaar::FeatureHaar()']]], + ['featureparams_131',['featureParams',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a124c98256e32e583049b9baf151b5ce3',1,'cv::CvFeatureEvaluator']]], + ['features_132',['Features',['https://docs.opencv.org/4.2.0/dc/d7d/tutorial_py_brief.html',1,'BRIEF (Binary Robust Independent Elementary Features)'],['https://docs.opencv.org/4.2.0/dd/d49/tutorial_py_contour_features.html',1,'Contour Features'],['https://docs.opencv.org/4.2.0/dc/dcf/tutorial_js_contour_features.html',1,'Contour Features'],['https://docs.opencv.org/4.2.0/df/d04/tutorial_js_table_of_contents_gui.html',1,'GUI Features'],['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'Introduction to SURF (Speeded-Up Robust Features)'],['https://docs.opencv.org/4.2.0/df/d54/tutorial_py_features_meaning.html',1,'Understanding Features']]], + ['features_133',['features',['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#a1533d1cad65832fad3621fb5226f03db',1,'cv::CvHaarEvaluator::features'],['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#a1c425fbb32bb6b27bf0b9fbda5383738',1,'cv::CvHOGEvaluator::features'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#acc44beb866238a3a6fa3111cec29076b',1,'cv::CvLBPEvaluator::features'],['https://docs.opencv.org/4.2.0/d2/dc7/structcv_1_1linemod_1_1Template.html#a72795393e691fccda8906544de0e8142',1,'cv::linemod::Template::features']]], + ['features_20algorithms_134',['Features Algorithms',['https://docs.opencv.org/4.2.0/d7/d7a/group__xfeatures2d__experiment.html',1,'Experimental 2D Features Algorithms'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html',1,'Non-free 2D Features Algorithms']]], + ['features_20finding_20and_20images_20matching_135',['Features Finding and Images Matching',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'']]], + ['features_20framework_136',['Features Framework',['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html',1,'2D Features Framework'],['https://docs.opencv.org/4.2.0/d1/db4/group__xfeatures2d.html',1,'Extra 2D Features Framework']]], + ['features_20framework_20feature2d_20module_137',['2D Features framework (feature2d module)',['https://docs.opencv.org/4.2.0/d9/d97/tutorial_table_of_content_features2d.html',1,'']]], + ['features_20in_20opencv_138',['Gui Features in OpenCV',['https://docs.opencv.org/4.2.0/dc/d4d/tutorial_py_table_of_contents_gui.html',1,'']]], + ['features_20matching_139',['AKAZE local features matching',['https://docs.opencv.org/4.2.0/db/d70/tutorial_akaze_matching.html',1,'']]], + ['features_20matching_20algorithm_140',['Experimental 2D Features Matching Algorithm',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html',1,'']]], + ['features_20to_20track_141',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], + ['features_20tutorial_142',['Line Features Tutorial',['https://docs.opencv.org/4.2.0/df/dfa/tutorial_line_descriptor_main.html',1,'']]], + ['features_2eh_143',['features.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00893.html',1,'']]], + ['features2d_20homography_20to_20find_20a_20known_20object_144',['Features2D + Homography to find a known object',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_feature_homography.html',1,'']]], + ['features2d_2ehpp_145',['features2d.hpp',['https://docs.opencv.org/4.2.0/d5/def/features2d_2features2d_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/d0d/features2d_8hpp.html',1,'(Global Namespace)']]], + ['features_5f_146',['features_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a3e3bcb444b3e4b4bd570653d247c8639',1,'cv::detail::BundleAdjusterBase']]], + ['featureset_147',['FeatureSet',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga776cf8e0301b18e19be4782754274fe0',1,'cv::cuda::FeatureSet'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga776cf8e0301b18e19be4782754274fe0',1,'FeatureSet(Global Namespace)']]], + ['featureset_148',['featureSet',['https://docs.opencv.org/4.2.0/d0/d0a/classcv_1_1Tracker.html#a8def260b357961c80f25dc686274ec7f',1,'cv::Tracker']]], + ['featuresetnumfeatures_149',['featureSetNumFeatures',['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html#a93b179a63208f2f6849595ffd4b901f1',1,'cv::TrackerMIL::Params::featureSetNumFeatures'],['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#a22848e20713337aaa9ae7dc6dfd8b96a',1,'cv::TrackerBoosting::Params::featureSetNumFeatures']]], + ['featuresfinder_150',['featuresFinder',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ad92b06472f22df6c9e25869fc58e9ceb',1,'cv::Stitcher::featuresFinder()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#af96ea17da5a882e990c0b77e43850179',1,'cv::Stitcher::featuresFinder() const']]], + ['featuresmatcher_151',['FeaturesMatcher',['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html',1,'cv::detail::FeaturesMatcher'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a24ba277980b3f2d220f2a0b01c527569',1,'cv::detail::FeaturesMatcher::FeaturesMatcher()']]], + ['featuresmatcher_152',['featuresMatcher',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a426a576f1e2c12d9d5437a86625564c0',1,'cv::Stitcher::featuresMatcher()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#adf4593da8d34466283ef0cdd21fff3e7',1,'cv::Stitcher::featuresMatcher() const']]], + ['featuretype_153',['FeatureType',['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#aebd27314d1f03cb2b770888fb9d45b18',1,'cv::CvFeatureParams']]], + ['fedora_154',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], + ['feed_155',['feed',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html#a64837308bcf4e414a6219beff6cbe37a',1,'cv::detail::Blender::feed()'],['https://docs.opencv.org/4.2.0/d3/dab/classcv_1_1detail_1_1BlocksChannelsCompensator.html#a98fd8e7b3c10baebdcae600050e7ac6c',1,'cv::detail::BlocksChannelsCompensator::feed()'],['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html#a179fe61406583ec538c4569b57d062e2',1,'cv::detail::BlocksCompensator::feed()'],['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html#adfebf2569b39ef2599bc2fe98ac80a59',1,'cv::detail::BlocksGainCompensator::feed()'],['https://docs.opencv.org/4.2.0/d4/ddd/classcv_1_1detail_1_1ChannelsCompensator.html#adbe4fab11316d30158a89a5602a10e4f',1,'cv::detail::ChannelsCompensator::feed()'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ae6b0cc69a7bc53818ddea53eddb6bdba',1,'cv::detail::ExposureCompensator::feed(const std::vector< Point > &corners, const std::vector< UMat > &images, const std::vector< UMat > &masks)'],['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#a469ee24e889b645c2a0648658b356043',1,'cv::detail::ExposureCompensator::feed(const std::vector< Point > &corners, const std::vector< UMat > &images, const std::vector< std::pair< UMat, uchar > > &masks)=0'],['https://docs.opencv.org/4.2.0/d4/d69/classcv_1_1detail_1_1FeatherBlender.html#a2524f767f9651491a7f81bd363e63e39',1,'cv::detail::FeatherBlender::feed()'],['https://docs.opencv.org/4.2.0/d0/de1/classcv_1_1detail_1_1GainCompensator.html#a82008c64988de865ef4ae34491ece331',1,'cv::detail::GainCompensator::feed()'],['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html#a71c5311ae8432eaf69bae7d97ca1f3fe',1,'cv::detail::MultiBandBlender::feed()'],['https://docs.opencv.org/4.2.0/d2/dc1/classcv_1_1detail_1_1NoExposureCompensator.html#ade1d7db11e1695e8ba2a5359e7102e64',1,'cv::detail::NoExposureCompensator::feed()'],['../classutil_1_1Watchdog.html#a8229de63013993a4056291d5360ddc78',1,'util::Watchdog::feed()']]], + ['female_156',['female',['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html#gga3bdb11e4d5333d49ecab1e789fcce58ea428e94219615ce49fda832cf97a382fb',1,'cv::datasets::female'],['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html#gga3bdb11e4d5333d49ecab1e789fcce58ea428e94219615ce49fda832cf97a382fb',1,'female(Global Namespace)']]], + ['fenv_2eh_157',['fenv.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00005.html',1,'']]], + ['ff_158',['ff',['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a127f8256b9e7db44396137e4fc663f0a',1,'cv::gapi::wip::draw::Text']]], + ['fgdparams_159',['FGDParams',['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html',1,'cv::cuda::FGDParams'],['https://docs.opencv.org/4.2.0/de/def/structcv_1_1cuda_1_1FGDParams.html#a29e0c8c9f237e3da48ea9dda2f44505f',1,'cv::cuda::FGDParams::FGDParams()']]], + ['fh_160',['fh',['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#a6506f033f7f7696b9b1c8b9c707a53cd',1,'cv::gapi::wip::draw::FText']]], + ['fht_5fadd_161',['FHT_ADD',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a998fc1e1cca9a365651dd9917205f991a359b7ee9f22eb20107d8600fb92e09e8',1,'cv::ximgproc']]], + ['fht_5fave_162',['FHT_AVE',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a998fc1e1cca9a365651dd9917205f991aa4f4c96ce42b4e255925a00f018db333',1,'cv::ximgproc']]], + ['fht_5fmax_163',['FHT_MAX',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a998fc1e1cca9a365651dd9917205f991ac543a6f391969565a70ee23f975a8d75',1,'cv::ximgproc']]], + ['fht_5fmin_164',['FHT_MIN',['https://docs.opencv.org/4.2.0/d9/d29/namespacecv_1_1ximgproc.html#a998fc1e1cca9a365651dd9917205f991ac775165fcc9202a066e85aa58db24e5a',1,'cv::ximgproc']]], + ['fiducial_5fscore_165',['fiducial_score',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#a63efee372a9c5c42cdfc67f092ccbbba',1,'cv::datasets::FR_adienceObj']]], + ['fiducial_5fyaw_5fangle_166',['fiducial_yaw_angle',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#a72ea703d36fa29d577cc97d00139e349',1,'cv::datasets::FR_adienceObj']]], + ['file_167',['file',['https://docs.opencv.org/4.2.0/df/dc0/tutorial_qds_export_parameters.html',1,'Exporting a template parameter file'],['https://docs.opencv.org/4.2.0/d4/dd9/structcvv_1_1impl_1_1CallMetaData.html#acedbc755e15b5a0d955cbe58108537f4',1,'cvv::impl::CallMetaData::file'],['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#afef67d957832b1e20e24208a1da57379',1,'cv::Exception::file'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#ad6abbe04f3851c05497276f37eb2c154',1,'__gnu_cxx::stdio_filebuf::file()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10671.html#ad299b6d238aa256ffb021a3d4cd544da',1,'__gnu_cxx::stdio_sync_filebuf::file()']]], + ['file_20input_20and_20output_20using_20xml_20and_20yaml_20files_168',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], + ['file_20reading_20and_20writing_169',['Image file reading and writing',['https://docs.opencv.org/4.2.0/d4/da8/group__imgcodecs.html',1,'']]], + ['file_5finput_5foutput_5fwith_5fxml_5fyml_2emarkdown_170',['file_input_output_with_xml_yml.markdown',['https://docs.opencv.org/4.2.0/db/db0/file__input__output__with__xml__yml_8markdown.html',1,'']]], + ['filebuf_171',['filebuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gaa33740c61965014b7bc0f229f73f65ad',1,'std::filebuf'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gaa33740c61965014b7bc0f229f73f65ad',1,'filebuf(Global Namespace)']]], + ['filename_172',['fileName',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#add0020a627fead72259285e837069056',1,'cv::datasets::HPE_humanevaObj::fileName'],['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1datasets_1_1TR__icdarObj.html#a9e189665fb29ff90c2be90643a9b19e9',1,'cv::datasets::TR_icdarObj::fileName'],['https://docs.opencv.org/4.2.0/d3/dc5/structcv_1_1datasets_1_1TR__svtObj.html#a303cc5b4a391a455d9e93a7a7da9a869',1,'cv::datasets::TR_svtObj::fileName']]], + ['filename_173',['filename',['https://docs.opencv.org/4.2.0/d0/db6/structcv_1_1datasets_1_1OR__pascalObj.html#a43281c86747b2a116960953662ebd93f',1,'cv::datasets::OR_pascalObj::filename'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1datasets_1_1PD__inriaObj.html#a376d963836cb12a17767969d9b7455b0',1,'cv::datasets::PD_inriaObj::filename']]], + ['filenameorid_174',['filenameOrID',['../structcam_1_1CameraConfig.html#ab308ad40c78d14a529c86c0365ec9898',1,'cam::CameraConfig']]], + ['filenode_175',['FileNode',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html',1,'cv::FileNode'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a062a89a78d3cab1e7949b3d0fd3d60ee',1,'cv::FileNode::FileNode()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#adb447cc64f8461cbfaea20d203b8fb4e',1,'cv::FileNode::FileNode(const FileStorage *fs, size_t blockIdx, size_t ofs)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a3f12e82f34ff7f1be73eea1270a35d50',1,'cv::FileNode::FileNode(const FileNode &node)']]], + ['filenodeiterator_176',['FileNodeIterator',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html',1,'cv::FileNodeIterator'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#aa048945804bcbd368db919ce3ef775e5',1,'cv::FileNodeIterator::FileNodeIterator()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ac4cf40e6c8b2d85e956dd35d2fa82382',1,'cv::FileNodeIterator::FileNodeIterator(const FileNode &node, bool seekEnd)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a0e43453413ee5ee52b51c4061733aeb1',1,'cv::FileNodeIterator::FileNodeIterator(const FileNodeIterator &it)']]], + ['files_177',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], + ['files_20with_20gdal_178',['Reading Geospatial Raster files with GDAL',['https://docs.opencv.org/4.2.0/d7/d73/tutorial_raster_io_gdal.html',1,'']]], + ['filestorage_179',['FileStorage',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html',1,'cv::FileStorage'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a29bcb12ede10d87a0fcbf89a88b092af',1,'cv::FileStorage::FileStorage()'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a587b4f5793a894fbe245e95cb30d6bc7',1,'cv::FileStorage::FileStorage(const String &filename, int flags, const String &encoding=String())']]], + ['filesystem_180',['filesystem',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01010.html',1,'']]], + ['filesystem_20ts_181',['Filesystem TS',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01521.html',1,'']]], + ['filesystem_2ehpp_182',['filesystem.hpp',['https://docs.opencv.org/4.2.0/d1/d85/filesystem_8hpp.html',1,'']]], + ['filesystem_2eprivate_2ehpp_183',['filesystem.private.hpp',['https://docs.opencv.org/4.2.0/d3/d48/filesystem_8private_8hpp.html',1,'']]], + ['fill_184',['fill',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#ad26f2b09d9868cf108e84c9814aa682d',1,'cv::RNG::fill()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'basic_ios< char, _Traits >::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'basic_ios< char, _Traits >::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'basic_iostream< char >::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'basic_iostream< char >::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'basic_istream< char >::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'basic_istream< char >::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'basic_istream< char, _Traits >::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'basic_istream< char, _Traits >::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'basic_ostream< char >::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'basic_ostream< char >::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'basic_ostream< char, _Traits >::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'basic_ostream< char, _Traits >::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_fstream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_fstream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_ifstream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_ifstream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_ios::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_ios::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_iostream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_iostream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_istream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_istream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_istringstream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_istringstream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_ofstream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_ofstream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_ostream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_ostream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_ostringstream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_ostringstream::fill(char_type __ch)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a8b6a8fc0ddc82328520534e9e99de88e',1,'std::basic_stringstream::fill() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5b7921d8ecf89d75e188e9ed972af448',1,'std::basic_stringstream::fill(char_type __ch)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9be169c308801411aa24be93d30930bf',1,'Eigen::DenseBase::fill()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9be169c308801411aa24be93d30930bf',1,'DenseBase< ArrayWrapper< ExpressionType > >::fill()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9be169c308801411aa24be93d30930bf',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::fill()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9be169c308801411aa24be93d30930bf',1,'DenseBase< Solve< Decomposition, RhsType > >::fill()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#ab1086025ddef904f5fae0282de474d24',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::fill()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gab2e4bb5cc3300aaf6c0e5bdc3371bf06',1,'std::fill()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gab2e4bb5cc3300aaf6c0e5bdc3371bf06',1,'fill()(Global Namespace)']]], + ['fill_5fminimal_5fn_185',['fill_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ae12932b6ecb49293c8c68a0d5dbf8919',1,'__gnu_parallel::_Settings']]], + ['fill_5fn_186',['fill_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga0af400b776b8486401daf6ecf91bacca',1,'std::fill_n()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga0af400b776b8486401daf6ecf91bacca',1,'fill_n()(Global Namespace)']]], + ['fillconstraints_187',['fillConstraints',['https://docs.opencv.org/4.2.0/d5/d5e/classcv_1_1optflow_1_1PCAPrior.html#afbd580da9e1e1dad67a39f094bb7e0c9',1,'cv::optflow::PCAPrior']]], + ['fillconvexpoly_188',['fillConvexPoly',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga3069baf93b51565e386c8e591f8418e6',1,'cv::fillConvexPoly(InputOutputArray img, const Point *pts, int npts, const Scalar &color, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga9bb982be9d641dc51edd5e8ae3624e1f',1,'cv::fillConvexPoly(InputOutputArray img, InputArray points, const Scalar &color, int lineType=LINE_8, int shift=0)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga3069baf93b51565e386c8e591f8418e6',1,'fillConvexPoly(InputOutputArray img, const Point *pts, int npts, const Scalar &color, int lineType=LINE_8, int shift=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga9bb982be9d641dc51edd5e8ae3624e1f',1,'fillConvexPoly(InputOutputArray img, InputArray points, const Scalar &color, int lineType=LINE_8, int shift=0)(Global Namespace)']]], + ['filled_189',['FILLED',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a89c5f6beef080e6df347167f85e07b9e',1,'cv::FILLED'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a89c5f6beef080e6df347167f85e07b9e',1,'FILLED(Global Namespace)']]], + ['fillfixed_190',['fillFixed',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a931f3b7eddb7c9ff104a4c05defce512',1,'cv::omnidir::internal']]], + ['fillfixedstereo_191',['fillFixedStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a877fd2f07d10492659c1835d8206d08f',1,'cv::omnidir::internal']]], + ['fillpoly_192',['fillPoly',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga8c69b68fab5f25e2223b6496aa60dad5',1,'cv::fillPoly(InputOutputArray img, const Point **pts, const int *npts, int ncontours, const Scalar &color, int lineType=LINE_8, int shift=0, Point offset=Point())'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga311160e71d37e3b795324d097cb3a7dc',1,'cv::fillPoly(InputOutputArray img, InputArrayOfArrays pts, const Scalar &color, int lineType=LINE_8, int shift=0, Point offset=Point())'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga8c69b68fab5f25e2223b6496aa60dad5',1,'fillPoly(InputOutputArray img, const Point **pts, const int *npts, int ncontours, const Scalar &color, int lineType=LINE_8, int shift=0, Point offset=Point())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ga311160e71d37e3b795324d097cb3a7dc',1,'fillPoly(InputOutputArray img, InputArrayOfArrays pts, const Scalar &color, int lineType=LINE_8, int shift=0, Point offset=Point())(Global Namespace)']]], + ['filter_193',['Filter',['https://docs.opencv.org/4.2.0/dc/d2b/classcv_1_1cuda_1_1Filter.html',1,'cv::cuda::Filter'],['https://docs.opencv.org/4.2.0/d1/dfd/tutorial_motion_deblur_filter.html',1,'Motion Deblur Filter'],['https://docs.opencv.org/4.2.0/de/d3c/tutorial_out_of_focus_deblur_filter.html',1,'Out-of-focus Deblur Filter'],['https://docs.opencv.org/4.2.0/d2/d0b/tutorial_periodic_noise_removing_filter.html',1,'Periodic Noise Removing Filter']]], + ['filter_194',['filter',['https://docs.opencv.org/4.2.0/de/db7/classcv_1_1ximgproc_1_1AdaptiveManifoldFilter.html#a66138c103e5bc2976a2cce127a775e6a',1,'cv::ximgproc::AdaptiveManifoldFilter::filter()'],['https://docs.opencv.org/4.2.0/db/d72/classcv_1_1ximgproc_1_1DisparityFilter.html#a3dc752f1760b375f1ea12173c1f07a9e',1,'cv::ximgproc::DisparityFilter::filter()'],['https://docs.opencv.org/4.2.0/d3/d9d/classcv_1_1ximgproc_1_1DTFilter.html#a252bada5a4f25071183b4b93ab21303f',1,'cv::ximgproc::DTFilter::filter()'],['https://docs.opencv.org/4.2.0/db/d50/classcv_1_1ximgproc_1_1FastBilateralSolverFilter.html#acfa4034b01fe2503b9e0932e5f543fff',1,'cv::ximgproc::FastBilateralSolverFilter::filter()'],['https://docs.opencv.org/4.2.0/de/d13/classcv_1_1ximgproc_1_1FastGlobalSmootherFilter.html#ad27f0d7c7c20926046ed89a93f79784d',1,'cv::ximgproc::FastGlobalSmootherFilter::filter()'],['https://docs.opencv.org/4.2.0/de/d73/classcv_1_1ximgproc_1_1GuidedFilter.html#a342f5ac3131a9e4c06472c587668eb40',1,'cv::ximgproc::GuidedFilter::filter()'],['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a32b3b9f6efa4e6f8bd37695252bd50b1',1,'cv::dnn_objdetect::InferBbox::filter()'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga99c17738a69b556b18bc86e7aee1a1d9',1,'cv::ft::filter()'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html#ga99c17738a69b556b18bc86e7aee1a1d9',1,'filter(InputArray image, InputArray kernel, OutputArray output)(Global Namespace)']]], + ['filter_2ehpp_195',['filter.hpp',['https://docs.opencv.org/4.2.0/d1/dd2/filter_8hpp.html',1,'']]], + ['filter2d_196',['filter2D',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga27c049795ce870216ddfb366086b5a04',1,'cv::filter2D()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga7f2fc386cd3ecb074d65b3ad124f38eb',1,'cv::gapi::filter2D()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga42c2468ab3a1238fbf48458c57169081',1,'cv::hal::filter2D()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga27c049795ce870216ddfb366086b5a04',1,'filter2D(InputArray src, OutputArray dst, int ddepth, InputArray kernel, Point anchor=Point(-1,-1), double delta=0, int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga42c2468ab3a1238fbf48458c57169081',1,'filter2D(int stype, int dtype, int kernel_type, uchar *src_data, size_t src_step, uchar *dst_data, size_t dst_step, int width, int height, int full_width, int full_height, int offset_x, int offset_y, uchar *kernel_data, size_t kernel_step, int kernel_width, int kernel_height, int anchor_x, int anchor_y, double delta, int borderType, bool isSubmatrix)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga7f2fc386cd3ecb074d65b3ad124f38eb',1,'filter2D(const GMat &src, int ddepth, const Mat &kernel, const Point &anchor=Point(-1,-1), const Scalar &delta=Scalar(0), int borderType=BORDER_DEFAULT, const Scalar &borderValue=Scalar(0))(Global Namespace)']]], + ['filter_5f2d_2emarkdown_197',['filter_2d.markdown',['https://docs.opencv.org/4.2.0/d3/db5/filter__2d_8markdown.html',1,'']]], + ['filter_5flr_198',['filter_lr',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a03d0e10ae843a582f5afac7af29337a4',1,'cv::TrackerCSRT::Params']]], + ['filter_5fscharr_199',['FILTER_SCHARR',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggad8e695e87dee497e227716576c244598a460c815d2bb921fb7f53f4220e19c1d5',1,'cv::FILTER_SCHARR'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ggad8e695e87dee497e227716576c244598a460c815d2bb921fb7f53f4220e19c1d5',1,'FILTER_SCHARR(Global Namespace)']]], + ['filter_5ftop_5fn_200',['filter_top_n',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#ac85adaf91b32341eb158588e65b5679b',1,'cv::dnn_objdetect::InferBbox']]], + ['filterbyarea_201',['filterByArea',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a890564e4256e98e1ca41724c669735a3',1,'cv::SimpleBlobDetector::Params']]], + ['filterbycircularity_202',['filterByCircularity',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a4929ee3a121d95a6af9710fa9ec5fe4c',1,'cv::SimpleBlobDetector::Params']]], + ['filterbycolor_203',['filterByColor',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a66779ffec01dcc2ab2a6fe570ed7d717',1,'cv::SimpleBlobDetector::Params']]], + ['filterbyconvexity_204',['filterByConvexity',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#ae54a754ab1f2be433a2457994e4c4ac3',1,'cv::SimpleBlobDetector::Params']]], + ['filterbyinertia_205',['filterByInertia',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#af07129ad934a3d12fed2180458445420',1,'cv::SimpleBlobDetector::Params']]], + ['filterhomographydecompbyvisiblerefpoints_206',['filterHomographyDecompByVisibleRefpoints',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga32f867159200f7bd55e72dca92d8494c',1,'cv::filterHomographyDecompByVisibleRefpoints()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga32f867159200f7bd55e72dca92d8494c',1,'filterHomographyDecompByVisibleRefpoints(InputArrayOfArrays rotations, InputArrayOfArrays normals, InputArray beforePoints, InputArray afterPoints, OutputArray possibleSolutions, InputArray pointsMask=noArray())(Global Namespace)']]], + ['filtering_207',['Filtering',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html',1,'Image Filtering'],['https://docs.opencv.org/4.2.0/dc/d66/group__cudafilters.html',1,'Image Filtering']]], + ['filtering_208',['Disparity map post-filtering',['https://docs.opencv.org/4.2.0/d3/d14/tutorial_ximgproc_disparity_filtering.html',1,'']]], + ['filtering_20using_20f_20transform_209',['Filtering using F-transform',['https://docs.opencv.org/4.2.0/d3/d1d/tutorial_fuzzy_filtering.html',1,'']]], + ['filtering_2emarkdown_210',['filtering.markdown',['https://docs.opencv.org/4.2.0/de/d42/filtering_8markdown.html',1,'']]], + ['filters_211',['Filters',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html',1,'']]], + ['filters_212',['filters',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html',1,'Graph API: Image filters'],['https://docs.opencv.org/4.2.0/d4/dbd/tutorial_filter_2d.html',1,'Making your own linear filters!']]], + ['filters_2ehpp_213',['filters.hpp',['https://docs.opencv.org/4.2.0/d3/d10/filters_8hpp.html',1,'']]], + ['filters_3a_3astatespace_214',['statespace',['../namespacefilters_1_1statespace.html',1,'filters']]], + ['filterspeckles_215',['filterSpeckles',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gabe331f205a6dd7a9aa5db8a38157d25b',1,'cv::filterSpeckles()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gabe331f205a6dd7a9aa5db8a38157d25b',1,'filterSpeckles()(Global Namespace)']]], + ['final_5fprobability_5fdist_216',['final_probability_dist',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a77d8731db72035c2e8dd73ee33278de9',1,'cv::dnn_objdetect::InferBbox']]], + ['final_5fshow_2ehpp_217',['final_show.hpp',['https://docs.opencv.org/4.2.0/db/d19/final__show_8hpp.html',1,'']]], + ['finalframe_5f_218',['finalFrame_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#af52740f8abfa2a537aa64e994f35ef6b',1,'cv::videostab::StabilizerBase']]], + ['finalize_219',['finalize',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a070e355e782f14f97879f18747fd70fc',1,'cv::dnn::Layer::finalize(const std::vector< Mat * > &input, std::vector< Mat > &output)'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a45db2ad86a84737afa623976a957a7e6',1,'cv::dnn::Layer::finalize(InputArrayOfArrays inputs, OutputArrayOfArrays outputs)'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a0b9321b1c809d7804e602b6a862d2217',1,'cv::dnn::Layer::finalize(const std::vector< Mat > &inputs, std::vector< Mat > &outputs)'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a713fddc29f4cb873ea720a2c034dff48',1,'cv::dnn::Layer::finalize(const std::vector< Mat > &inputs)'],['https://docs.opencv.org/4.2.0/de/d47/classcv_1_1viz_1_1WCloudCollection.html#a97c9516c974908628d799c02dc359030',1,'cv::viz::WCloudCollection::finalize()'],['https://docs.opencv.org/4.2.0/df/d97/classcv_1_1viz_1_1WWidgetMerger.html#a03faf9f0cdd111224cede259033308ee',1,'cv::viz::WWidgetMerger::finalize()']]], + ['finalshow_220',['finalShow',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga06724816aad0970637457645ae60c8ca',1,'finalShow()(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga06724816aad0970637457645ae60c8ca',1,'cvv::finalShow()'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga06724816aad0970637457645ae60c8ca',1,'cvv::impl::finalShow()']]], + ['finalshowcaller_221',['FinalShowCaller',['https://docs.opencv.org/4.2.0/d0/da3/classcvv_1_1FinalShowCaller.html',1,'cvv']]], + ['find_222',['find',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a7914624907986f7a94dd424209a8a609',1,'cv::detail::DpSeamFinder::find()'],['https://docs.opencv.org/4.2.0/db/dda/classcv_1_1detail_1_1GraphCutSeamFinder.html#aea2fc0865be1d3134b8dde43ae3e9dd4',1,'cv::detail::GraphCutSeamFinder::find()'],['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1detail_1_1NoSeamFinder.html#ad51c7e7563d047c8217d051570518b85',1,'cv::detail::NoSeamFinder::find()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a8f7dd0036f534991ec6d02a86dc509a4',1,'cv::detail::PairwiseSeamFinder::find()'],['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html#abaf8facb8e4b77cffcc9085997833989',1,'cv::detail::SeamFinder::find()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af31f0f8c0f55db0640aa8081a593f64e',1,'cv::SparseMat::find(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a782dd472d4a859a13dc77fca7e4ef8a6',1,'cv::SparseMat::find(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#aca75a3e5266b78bafcd01dffe75e563d',1,'cv::SparseMat::find(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a6a68ed5f9b65fa36c3d209c0dafa24a8',1,'cv::SparseMat::find(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af31f0f8c0f55db0640aa8081a593f64e',1,'cv::SparseMat::find(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a782dd472d4a859a13dc77fca7e4ef8a6',1,'cv::SparseMat::find(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#aca75a3e5266b78bafcd01dffe75e563d',1,'cv::SparseMat::find(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a6a68ed5f9b65fa36c3d209c0dafa24a8',1,'cv::SparseMat::find(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/db/d24/classcv_1_1detail_1_1VoronoiSeamFinder.html#a779eced4775e0a2af9e7b7283b0f70f9',1,'cv::detail::VoronoiSeamFinder::find(const std::vector< UMat > &src, const std::vector< Point > &corners, std::vector< UMat > &masks) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/db/d24/classcv_1_1detail_1_1VoronoiSeamFinder.html#a0e48673f52e0ae578e4f4315590b04e1',1,'cv::detail::VoronoiSeamFinder::find(const std::vector< Size > &size, const std::vector< Point > &corners, std::vector< UMat > &masks)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a1cd14e7fb27530a1859047f74e7262f9',1,'__gnu_cxx::__versa_string::find(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a68746de47d8142951be577a34bad453f',1,'__gnu_cxx::__versa_string::find(const __versa_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aff1f1c68135474bef1e118d9f90a0624',1,'__gnu_cxx::__versa_string::find(const _CharT *__s, size_type __pos=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a68d1fb6f098a29470128421c04605a18',1,'__gnu_cxx::__versa_string::find(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'__gnu_debug::basic_string::find()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< _CharT >::find(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< _CharT >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< _CharT >::find(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< _CharT >::find(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< _CharT, _Traits, _Allocator >::find(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< _CharT, _Traits, _Allocator >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< _CharT, _Traits, _Allocator >::find(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< _CharT, _Traits, _Allocator >::find(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find(const _Elem *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find(_Elem __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< char >::find(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< char >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< char >::find(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< char >::find(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< char_type, _Traits, _Alloc >::find(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< char_type, _Traits, _Alloc >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< char_type, _Traits, _Alloc >::find(const char_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< char_type, _Traits, _Alloc >::find(char_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< value_type >::find(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< value_type >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< value_type >::find(const value_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< value_type >::find(value_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'std::basic_string::find(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'std::basic_string::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'std::basic_string::find(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'std::basic_string::find(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#abdcd985632d8ad7ddba069aa776e2dfe',1,'std::map::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a39303b5617b240f3049dbb0d195789f5',1,'std::map::find(const _Kt &__x) -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a07cdb0ebaf753ec1244849dbff2ec4cf',1,'std::map::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#accf5f3477b6615f6b31fcb1adf068dfc',1,'std::map::find(const _Kt &__x) const -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#abdcd985632d8ad7ddba069aa776e2dfe',1,'std::map::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a39303b5617b240f3049dbb0d195789f5',1,'std::map::find(const _Kt &__x) -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a07cdb0ebaf753ec1244849dbff2ec4cf',1,'std::map::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#accf5f3477b6615f6b31fcb1adf068dfc',1,'std::map::find(const _Kt &__x) const -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a3ee75438d859fab67b756b7282a9a4d3',1,'std::multimap::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a84c1e49764e53439674b8f7e8baf33d4',1,'std::multimap::find(const _Kt &__x) -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2cef7a0c61ebd047d63d456e73c7167f',1,'std::multimap::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a71793c903d56962b5f25f08ba76e4196',1,'std::multimap::find(const _Kt &__x) const -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a3ee75438d859fab67b756b7282a9a4d3',1,'std::multimap::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a84c1e49764e53439674b8f7e8baf33d4',1,'std::multimap::find(const _Kt &__x) -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2cef7a0c61ebd047d63d456e73c7167f',1,'std::multimap::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a71793c903d56962b5f25f08ba76e4196',1,'std::multimap::find(const _Kt &__x) const -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a88ae213f5272a4de1e360e1e69335d8b',1,'std::multiset::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae1bc7a281212bde2b7b49e3a7589c0cc',1,'std::multiset::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ad558199cc94a4197f0623861bc955f1a',1,'std::multiset::find(const _Kt &__x) -> decltype(iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae3d52c5bfb2c4ae04923e6bd96a01ae7',1,'std::multiset::find(const _Kt &__x) const -> decltype(const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a88ae213f5272a4de1e360e1e69335d8b',1,'std::multiset::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae1bc7a281212bde2b7b49e3a7589c0cc',1,'std::multiset::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ad558199cc94a4197f0623861bc955f1a',1,'std::multiset::find(const _Kt &__x) -> decltype(iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae3d52c5bfb2c4ae04923e6bd96a01ae7',1,'std::multiset::find(const _Kt &__x) const -> decltype(const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af20eddb69820079242b06871210f9b06',1,'std::set::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af9b85bc6147d2b93a7a470ab20baab1a',1,'std::set::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a70c1741d5e747b2b0a3ae6217fc5906d',1,'std::set::find(const _Kt &__x) -> decltype(iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ac46165e1a88cdf7f318309c2c35f028d',1,'std::set::find(const _Kt &__x) const -> decltype(const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af20eddb69820079242b06871210f9b06',1,'std::set::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af9b85bc6147d2b93a7a470ab20baab1a',1,'std::set::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a70c1741d5e747b2b0a3ae6217fc5906d',1,'std::set::find(const _Kt &__x) -> decltype(iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ac46165e1a88cdf7f318309c2c35f028d',1,'std::set::find(const _Kt &__x) const -> decltype(const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ad62fc2387c4fa4aefe228c14239f8c40',1,'std::unordered_map::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a589217c1b2ed3f77f57aeb41d5192d0d',1,'std::unordered_map::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ad62fc2387c4fa4aefe228c14239f8c40',1,'std::unordered_map::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a589217c1b2ed3f77f57aeb41d5192d0d',1,'std::unordered_map::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a9f64e8fbc46b2fec76e96499ac91c8b6',1,'std::unordered_multimap::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a3a54562ef76d4966a496b86691fdfb12',1,'std::unordered_multimap::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a9f64e8fbc46b2fec76e96499ac91c8b6',1,'std::unordered_multimap::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a3a54562ef76d4966a496b86691fdfb12',1,'std::unordered_multimap::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a3abb4ae4616bf85eb3201d4488007420',1,'std::unordered_multiset::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af99eeb8286c1266dba2e9155f8efe0b6',1,'std::unordered_multiset::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a3abb4ae4616bf85eb3201d4488007420',1,'std::unordered_multiset::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af99eeb8286c1266dba2e9155f8efe0b6',1,'std::unordered_multiset::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#af673d30d52e825e4f8da4c8770f0589b',1,'std::unordered_set::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a1f05b3fd1a72e6b246b0e5ce8d0937cf',1,'std::unordered_set::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#af673d30d52e825e4f8da4c8770f0589b',1,'std::unordered_set::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a1f05b3fd1a72e6b246b0e5ce8d0937cf',1,'std::unordered_set::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ad62fc2387c4fa4aefe228c14239f8c40',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a589217c1b2ed3f77f57aeb41d5192d0d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ad62fc2387c4fa4aefe228c14239f8c40',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a589217c1b2ed3f77f57aeb41d5192d0d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::find(const key_type &__x) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_acdf9b3aab82dcf443dd91ca5ec06b80c.html#acdf9b3aab82dcf443dd91ca5ec06b80c',1,'nlohmann::basic_json::find(KeyT &&key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a17a516671c29a69bb2e11ca12030316b.html#a17a516671c29a69bb2e11ca12030316b',1,'nlohmann::basic_json::find(KeyT &&key) const'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a2486527ac56e07d58946ae9a93a46bc8.html#a2486527ac56e07d58946ae9a93a46bc8',1,'nlohmann::ordered_map::find(const Key &key)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a41e6e34fa8a90b96cbe5c71fec10d2ee.html#a41e6e34fa8a90b96cbe5c71fec10d2ee',1,'nlohmann::ordered_map::find(const Key &key) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga346cc7c0b794d9a487a11b44b6b238ab',1,'std::find()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga346cc7c0b794d9a487a11b44b6b238ab',1,'find(_InputIterator __first, _InputIterator __last, const _Tp &__val)(Global Namespace)']]], + ['find_20a_20known_20object_223',['Features2D + Homography to find a known object',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_feature_homography.html',1,'']]], + ['find_20objects_224',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], + ['find_20plot_20analyze_225',['Find Plot Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], + ['find_2eh_226',['find.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00896.html',1,'']]], + ['find4quadcornersubpix_227',['find4QuadCornerSubpix',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gab8816c8a176e1d78893b843b3f01557a',1,'cv::find4QuadCornerSubpix()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gab8816c8a176e1d78893b843b3f01557a',1,'find4QuadCornerSubpix()(Global Namespace)']]], + ['find_5fby_5forder_228',['find_by_order',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#a514976f742b56de21e6672e674ab62f5',1,'__gnu_pbds::tree_order_statistics_node_update::find_by_order(size_type) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#ac8200dc2f6a2b071509c9a817bc48248',1,'__gnu_pbds::tree_order_statistics_node_update::find_by_order(size_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#ae110b0862e2ece5ba1e6c35c4ac4e2a6',1,'__gnu_pbds::trie_order_statistics_node_update::find_by_order(size_type) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#a635c02fe43bd67dd830531d387e9467c',1,'__gnu_pbds::trie_order_statistics_node_update::find_by_order(size_type)']]], + ['find_5fcontours_2emarkdown_229',['find_contours.markdown',['https://docs.opencv.org/4.2.0/da/d19/find__contours_8markdown.html',1,'']]], + ['find_5fend_230',['find_end',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaf97d3d3c35f24541246e9d222fd45d44',1,'std::find_end(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gac12e9d93b9b26024222cc645d2a4a8d5',1,'std::find_end(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2, _BinaryPredicate __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaf97d3d3c35f24541246e9d222fd45d44',1,'find_end(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gac12e9d93b9b26024222cc645d2a4a8d5',1,'find_end(_ForwardIterator1 __first1, _ForwardIterator1 __last1, _ForwardIterator2 __first2, _ForwardIterator2 __last2, _BinaryPredicate __comp)(Global Namespace)']]], + ['find_5ffirst_231',['find_first',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aa79a2a1fad69bbaab1be7de6fb5ad37d',1,'std::tr2::dynamic_bitset']]], + ['find_5ffirst_5fnot_5fof_232',['find_first_not_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a1cc1fe69137d69e0d691c83a8b7a877a',1,'__gnu_cxx::__versa_string::find_first_not_of(const __versa_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2a9d4a0f8ffbcaca7a55c874ca69bcaf',1,'__gnu_cxx::__versa_string::find_first_not_of(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a911f590a4037fa8c455eeb69836b83b6',1,'__gnu_cxx::__versa_string::find_first_not_of(const _CharT *__s, size_type __pos=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aa02fafa27ba203b3ebc29fa52c093865',1,'__gnu_cxx::__versa_string::find_first_not_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'__gnu_debug::basic_string::find_first_not_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< _CharT >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< _CharT >::find_first_not_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< _CharT >::find_first_not_of(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< _CharT >::find_first_not_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_not_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_not_of(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_not_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_not_of(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_not_of(const _Elem *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_not_of(_Elem __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< char >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< char >::find_first_not_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< char >::find_first_not_of(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< char >::find_first_not_of(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_not_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_not_of(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_not_of(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< char_type, _Traits, _Alloc >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< char_type, _Traits, _Alloc >::find_first_not_of(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< char_type, _Traits, _Alloc >::find_first_not_of(const char_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< char_type, _Traits, _Alloc >::find_first_not_of(char_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'basic_string< value_type >::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'basic_string< value_type >::find_first_not_of(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'basic_string< value_type >::find_first_not_of(const value_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'basic_string< value_type >::find_first_not_of(value_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3d161e0b4182e43e70778769cefdab8c',1,'std::basic_string::find_first_not_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2ecada165b41788e4817cb31b8e5269b',1,'std::basic_string::find_first_not_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#af929326691134537716b308d080f487f',1,'std::basic_string::find_first_not_of(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0766f7adbc9a185b21bb1356ab6e302f',1,'std::basic_string::find_first_not_of(_CharT __c, size_type __pos=0) const noexcept']]], + ['find_5ffirst_5fof_233',['find_first_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a51b79cb3c4f9cd8af4cead91f4faa39c',1,'__gnu_cxx::__versa_string::find_first_of(const __versa_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac9799d12f46f0c9ec33d0fd311e1b3c1',1,'__gnu_cxx::__versa_string::find_first_of(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#add4cabafc8f7d3a89e6317b1e690b095',1,'__gnu_cxx::__versa_string::find_first_of(const _CharT *__s, size_type __pos=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a291c0f4c8db9612efad3c478a3a0619d',1,'__gnu_cxx::__versa_string::find_first_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'__gnu_debug::basic_string::find_first_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< _CharT >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< _CharT >::find_first_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< _CharT >::find_first_of(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< _CharT >::find_first_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_of(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< _CharT, _Traits, _Allocator >::find_first_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_of(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_of(const _Elem *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_first_of(_Elem __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< char >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< char >::find_first_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< char >::find_first_of(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< char >::find_first_of(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_of(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_first_of(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< char_type, _Traits, _Alloc >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< char_type, _Traits, _Alloc >::find_first_of(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< char_type, _Traits, _Alloc >::find_first_of(const char_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< char_type, _Traits, _Alloc >::find_first_of(char_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'basic_string< value_type >::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'basic_string< value_type >::find_first_of(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'basic_string< value_type >::find_first_of(const value_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'basic_string< value_type >::find_first_of(value_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a118aa1e4afbe9d35b49eb36ad74e230a',1,'std::basic_string::find_first_of(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3539b87ea391ab52a571f62e3f4d3516',1,'std::basic_string::find_first_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae2873f45c9a0fcb04bd17eaec640540b',1,'std::basic_string::find_first_of(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ab065587ff286d2b7e0aa9ed49ceb871a',1,'std::basic_string::find_first_of(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga5f2c547c925b080c25f17765a755a0cb',1,'std::find_first_of(_InputIterator __first1, _InputIterator __last1, _ForwardIterator __first2, _ForwardIterator __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga4f6564022032cfc6ea5c24b6dce5b4a7',1,'std::find_first_of(_InputIterator __first1, _InputIterator __last1, _ForwardIterator __first2, _ForwardIterator __last2, _BinaryPredicate __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga5f2c547c925b080c25f17765a755a0cb',1,'find_first_of(_InputIterator __first1, _InputIterator __last1, _ForwardIterator __first2, _ForwardIterator __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga4f6564022032cfc6ea5c24b6dce5b4a7',1,'find_first_of(_InputIterator __first1, _InputIterator __last1, _ForwardIterator __first2, _ForwardIterator __last2, _BinaryPredicate __comp)(Global Namespace)']]], + ['find_5fif_234',['find_if',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaaf6e9995ebbd27994d7c73b375f86088',1,'std::find_if()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaaf6e9995ebbd27994d7c73b375f86088',1,'find_if()(Global Namespace)']]], + ['find_5fif_5fnot_235',['find_if_not',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaa0bfffb70439c7d2cab9e917e8d604a6',1,'std::find_if_not()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gaa0bfffb70439c7d2cab9e917e8d604a6',1,'find_if_not()(Global Namespace)']]], + ['find_5fincreasing_5ffactor_236',['find_increasing_factor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a9450672486f402afac0c0741fe1d76a8',1,'__gnu_parallel::_Settings']]], + ['find_5finitial_5fblock_5fsize_237',['find_initial_block_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a52caf5becdee8026dc2bf029f46e15d1',1,'__gnu_parallel::_Settings']]], + ['find_5flast_5fnot_5fof_238',['find_last_not_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a44ea35572c1492b236ddc2b5977309bb',1,'__gnu_cxx::__versa_string::find_last_not_of(const __versa_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a85e9808581c06885d492a7dc230b9c3d',1,'__gnu_cxx::__versa_string::find_last_not_of(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a69d482699c2e775c7f62dcb9392c7ada',1,'__gnu_cxx::__versa_string::find_last_not_of(const _CharT *__s, size_type __pos=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2e8dd285274cf21efe56bb58792ac67a',1,'__gnu_cxx::__versa_string::find_last_not_of(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'__gnu_debug::basic_string::find_last_not_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< _CharT >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< _CharT >::find_last_not_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< _CharT >::find_last_not_of(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< _CharT >::find_last_not_of(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_not_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_not_of(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_not_of(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_not_of(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_not_of(const _Elem *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_not_of(_Elem __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< char >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< char >::find_last_not_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< char >::find_last_not_of(const char *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< char >::find_last_not_of(char __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_not_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_not_of(const char *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_not_of(char __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< char_type, _Traits, _Alloc >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< char_type, _Traits, _Alloc >::find_last_not_of(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< char_type, _Traits, _Alloc >::find_last_not_of(const char_type *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< char_type, _Traits, _Alloc >::find_last_not_of(char_type __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'basic_string< value_type >::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'basic_string< value_type >::find_last_not_of(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'basic_string< value_type >::find_last_not_of(const value_type *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'basic_string< value_type >::find_last_not_of(value_type __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2a7d997ad1bf8f9667a18ba72f3d1608',1,'std::basic_string::find_last_not_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae7c601a7f29a2304f2f014faaa789652',1,'std::basic_string::find_last_not_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3e72d0dcdcb779d768feb37f0d10937d',1,'std::basic_string::find_last_not_of(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a779c081af38b8c6af0341ed88e19c69f',1,'std::basic_string::find_last_not_of(_CharT __c, size_type __pos=npos) const noexcept']]], + ['find_5flast_5fof_239',['find_last_of',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a14963706e6c95eea43af12f44d9b95ad',1,'__gnu_cxx::__versa_string::find_last_of(const __versa_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#add62aca46b830b7b503354a0e5da6dfc',1,'__gnu_cxx::__versa_string::find_last_of(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a12fc7455ac41d07a9350824d71d5ab3a',1,'__gnu_cxx::__versa_string::find_last_of(const _CharT *__s, size_type __pos=npos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae533d7eec1df0fb48aeaf38195134214',1,'__gnu_cxx::__versa_string::find_last_of(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'__gnu_debug::basic_string::find_last_of()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< _CharT >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< _CharT >::find_last_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< _CharT >::find_last_of(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< _CharT >::find_last_of(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_of(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< _CharT, _Traits, _Allocator >::find_last_of(_CharT __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_of(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_of(const _Elem *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find_last_of(_Elem __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< char >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< char >::find_last_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< char >::find_last_of(const char *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< char >::find_last_of(char __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_of(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_of(const char *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find_last_of(char __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< char_type, _Traits, _Alloc >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< char_type, _Traits, _Alloc >::find_last_of(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< char_type, _Traits, _Alloc >::find_last_of(const char_type *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< char_type, _Traits, _Alloc >::find_last_of(char_type __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'basic_string< value_type >::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'basic_string< value_type >::find_last_of(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'basic_string< value_type >::find_last_of(const value_type *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'basic_string< value_type >::find_last_of(value_type __c, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a5bd1d6df971b6e4cb7468ac97e1dd338',1,'std::basic_string::find_last_of(const basic_string &__str, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#abebb36705e89a99c9c8dd8b4968aa6f3',1,'std::basic_string::find_last_of(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a1eeebd95d63fe61d0ef78f369675ca89',1,'std::basic_string::find_last_of(const _CharT *__s, size_type __pos=npos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a88eae65c3d8e575c4e18b3f113fa3d05',1,'std::basic_string::find_last_of(_CharT __c, size_type __pos=npos) const noexcept']]], + ['find_5fmaximum_5fblock_5fsize_240',['find_maximum_block_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a6e85e9dffe870aad7d2155188b3dea99',1,'__gnu_parallel::_Settings']]], + ['find_5fnext_241',['find_next',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a011bdf5c380085fc00c15c368b060624',1,'std::tr2::dynamic_bitset']]], + ['find_5fno_5fstore_5fhash_5ffn_5fimps_2ehpp_242',['find_no_store_hash_fn_imps.hpp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01301.html',1,'']]], + ['find_5fscale_5ffactor_243',['find_scale_factor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ad1123e5b2d57ff40c415d893cfbf5a11',1,'__gnu_parallel::_Settings']]], + ['find_5fselectors_2eh_244',['find_selectors.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00899.html',1,'']]], + ['find_5fsequential_5fsearch_5fsize_245',['find_sequential_search_size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a755b0ae67b24dfe7d6f436e097a49620',1,'__gnu_parallel::_Settings']]], + ['find_5ftag_246',['find_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09731.html',1,'__gnu_parallel']]], + ['findchessboardcorners_247',['findChessboardCorners',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga93efa9b0aa890de240ca32b11253dd4a',1,'cv::findChessboardCorners()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga93efa9b0aa890de240ca32b11253dd4a',1,'findChessboardCorners()(Global Namespace)']]], + ['findchessboardcornerssb_248',['findChessboardCornersSB',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad0e88e13cd3d410870a99927510d7f91',1,'cv::findChessboardCornersSB()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad0e88e13cd3d410870a99927510d7f91',1,'findChessboardCornersSB()(Global Namespace)']]], + ['findchild_249',['findChild',['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#a05a7b1bb6798e5935eb061117b1bf435',1,'cv::Node::findChild(OBJECT &payload) const'],['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#a40acd5b53d7b3a60de989c00b47c2208',1,'cv::Node::findChild(Node< OBJECT > *pNode) const']]], + ['findcirclesgrid_250',['findCirclesGrid',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga7f02cd21c8352142890190227628fa80',1,'cv::findCirclesGrid(InputArray image, Size patternSize, OutputArray centers, int flags, const Ptr< FeatureDetector > &blobDetector, const CirclesGridFinderParameters &parameters)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gac8fb88c7652a7699743aeb6073ef9b4a',1,'cv::findCirclesGrid(InputArray image, Size patternSize, OutputArray centers, int flags=CALIB_CB_SYMMETRIC_GRID, const Ptr< FeatureDetector > &blobDetector=SimpleBlobDetector::create())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga7f02cd21c8352142890190227628fa80',1,'findCirclesGrid(InputArray image, Size patternSize, OutputArray centers, int flags, const Ptr< FeatureDetector > &blobDetector, const CirclesGridFinderParameters &parameters)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gac8fb88c7652a7699743aeb6073ef9b4a',1,'findCirclesGrid(InputArray image, Size patternSize, OutputArray centers, int flags=CALIB_CB_SYMMETRIC_GRID, const Ptr< FeatureDetector > &blobDetector=SimpleBlobDetector::create())(Global Namespace)']]], + ['findcontours_251',['findContours',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gadf1ad6a0b82947fa1fe3c3d497f260e0',1,'cv::findContours(InputArray image, OutputArrayOfArrays contours, OutputArray hierarchy, int mode, int method, Point offset=Point())'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gae4156f04053c44f886e387cff0ef6e08',1,'cv::findContours(InputArray image, OutputArrayOfArrays contours, int mode, int method, Point offset=Point())'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gadf1ad6a0b82947fa1fe3c3d497f260e0',1,'findContours(InputArray image, OutputArrayOfArrays contours, OutputArray hierarchy, int mode, int method, Point offset=Point())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gae4156f04053c44f886e387cff0ef6e08',1,'findContours(InputArray image, OutputArrayOfArrays contours, int mode, int method, Point offset=Point())(Global Namespace)']]], + ['findcorrespondences_252',['findCorrespondences',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga91c50d0cd4b35a72f3850f87fddec2cb',1,'cv::optflow::GPCForest::findCorrespondences()'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html#ga91c50d0cd4b35a72f3850f87fddec2cb',1,'findCorrespondences()(Global Namespace)']]], + ['findessentialmat_253',['findEssentialMat',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga13f7e34de8fa516a686a56af1196247f',1,'cv::findEssentialMat(InputArray points1, InputArray points2, InputArray cameraMatrix, int method=RANSAC, double prob=0.999, double threshold=1.0, OutputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga0c86f6478f36d5be6e450751bbf4fec0',1,'cv::findEssentialMat(InputArray points1, InputArray points2, double focal=1.0, Point2d pp=Point2d(0, 0), int method=RANSAC, double prob=0.999, double threshold=1.0, OutputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga13f7e34de8fa516a686a56af1196247f',1,'findEssentialMat(InputArray points1, InputArray points2, InputArray cameraMatrix, int method=RANSAC, double prob=0.999, double threshold=1.0, OutputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga0c86f6478f36d5be6e450751bbf4fec0',1,'findEssentialMat(InputArray points1, InputArray points2, double focal=1.0, Point2d pp=Point2d(0, 0), int method=RANSAC, double prob=0.999, double threshold=1.0, OutputArray mask=noArray())(Global Namespace)']]], + ['findfile_254',['findFile',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html#ga3a33b00033b46c698ff6340d95569c13',1,'cv::samples::findFile()'],['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html#ga3a33b00033b46c698ff6340d95569c13',1,'findFile()(Global Namespace)']]], + ['findfileorkeep_255',['findFileOrKeep',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html#ga4a37595bcd267558bd6c176c7307f050',1,'cv::samples::findFileOrKeep()'],['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html#ga4a37595bcd267558bd6c176c7307f050',1,'findFileOrKeep()(Global Namespace)']]], + ['findfundamentalmat_256',['findFundamentalMat',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gae420abc34eaa03d0c6a67359609d8429',1,'cv::findFundamentalMat(InputArray points1, InputArray points2, int method=FM_RANSAC, double ransacReprojThreshold=3., double confidence=0.99, OutputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga49ea1a98c80a5e7d50ad4361dcf2877a',1,'cv::findFundamentalMat(InputArray points1, InputArray points2, OutputArray mask, int method=FM_RANSAC, double ransacReprojThreshold=3., double confidence=0.99)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gae420abc34eaa03d0c6a67359609d8429',1,'findFundamentalMat(InputArray points1, InputArray points2, int method=FM_RANSAC, double ransacReprojThreshold=3., double confidence=0.99, OutputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga49ea1a98c80a5e7d50ad4361dcf2877a',1,'findFundamentalMat(InputArray points1, InputArray points2, OutputArray mask, int method=FM_RANSAC, double ransacReprojThreshold=3., double confidence=0.99)(Global Namespace)']]], + ['findhomography_257',['findHomography',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga4abc2ece9fab9398f2e560d53c8c9780',1,'cv::findHomography(InputArray srcPoints, InputArray dstPoints, int method=0, double ransacReprojThreshold=3, OutputArray mask=noArray(), const int maxIters=2000, const double confidence=0.995)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gafd3ef89257e27d5235f4467cbb1b6a63',1,'cv::findHomography(InputArray srcPoints, InputArray dstPoints, OutputArray mask, int method=0, double ransacReprojThreshold=3)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga4abc2ece9fab9398f2e560d53c8c9780',1,'findHomography(InputArray srcPoints, InputArray dstPoints, int method=0, double ransacReprojThreshold=3, OutputArray mask=noArray(), const int maxIters=2000, const double confidence=0.995)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gafd3ef89257e27d5235f4467cbb1b6a63',1,'findHomography(InputArray srcPoints, InputArray dstPoints, OutputArray mask, int method=0, double ransacReprojThreshold=3)(Global Namespace)']]], + ['finding_20and_20images_20matching_258',['Features Finding and Images Matching',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'']]], + ['finding_20contours_20in_20your_20image_259',['Finding contours in your image',['https://docs.opencv.org/4.2.0/df/d0d/tutorial_find_contours.html',1,'']]], + ['findinpair_260',['findInPair',['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a8e2d33396c0a012c7a256db8337435c6',1,'cv::detail::PairwiseSeamFinder']]], + ['findleafforpatch_261',['findLeafForPatch',['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#a6a0557a84e7c270037ba1af441dde526',1,'cv::optflow::GPCTree']]], + ['findmaxspanningtree_262',['findMaxSpanningTree',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gadb39c8dec819cf596194465bde94f4d2',1,'cv::detail::findMaxSpanningTree()'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gadb39c8dec819cf596194465bde94f4d2',1,'findMaxSpanningTree()(Global Namespace)']]], + ['findmaxvalexprbody_263',['FindMaxValExprBody',['https://docs.opencv.org/4.2.0/d9/d48/structcv_1_1cudev_1_1FindMaxValExprBody.html',1,'cv::cudev']]], + ['findmedian_264',['findMedian',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#ac02adc0c5f2a55ce62d684d34f59e857',1,'cv::omnidir::internal']]], + ['findmedian3_265',['findMedian3',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#ab91013ecd20ffd8e9f5f651f413a7a9e',1,'cv::omnidir::internal']]], + ['findminmax_266',['findMinMax',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gae7f5f2aa9f65314470a76fccdff887f2',1,'cv::cuda::findMinMax()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gae7f5f2aa9f65314470a76fccdff887f2',1,'findMinMax()(Global Namespace)']]], + ['findminmaxloc_267',['findMinMaxLoc',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga93916bc473a62d215d1130fab84d090a',1,'cv::cuda::findMinMaxLoc()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga93916bc473a62d215d1130fab84d090a',1,'findMinMaxLoc()(Global Namespace)']]], + ['findminmaxvalexprbody_268',['FindMinMaxValExprBody',['https://docs.opencv.org/4.2.0/dd/db3/structcv_1_1cudev_1_1FindMinMaxValExprBody.html',1,'cv::cudev']]], + ['findminvalexprbody_269',['FindMinValExprBody',['https://docs.opencv.org/4.2.0/df/d82/structcv_1_1cudev_1_1FindMinValExprBody.html',1,'cv::cudev']]], + ['findnearest_270',['findNearest',['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#a312f975c24725b57200e221a97474b45',1,'cv::ml::KNearest::findNearest()'],['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a3ec256af000e129e08eb5f269ccdeb0f',1,'cv::Subdiv2D::findNearest()']]], + ['findnonzero_271',['findNonZero',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaed7df59a3539b4cc0fe5c9c8d7586190',1,'cv::findNonZero()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaed7df59a3539b4cc0fe5c9c8d7586190',1,'findNonZero()(Global Namespace)']]], + ['findpattern_272',['findPattern',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a968d86b3c84215f91e992e961352287b',1,'cv::ccalib::CustomPattern']]], + ['findprocammatches_273',['findProCamMatches',['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1structured__light_1_1SinusoidalPattern.html#a38e038bd6af04cc2add84f2d16daafd4',1,'cv::structured_light::SinusoidalPattern']]], + ['findrt_274',['findRt',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#ae16f40289d6f364a772ca46863d61a09',1,'cv::ccalib::CustomPattern::findRt(InputArray objectPoints, InputArray imagePoints, InputArray cameraMatrix, InputArray distCoeffs, InputOutputArray rvec, InputOutputArray tvec, bool useExtrinsicGuess=false, int flags=SOLVEPNP_ITERATIVE)'],['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#af718c66db3c5aca64ad160366f97dbff',1,'cv::ccalib::CustomPattern::findRt(InputArray image, InputArray cameraMatrix, InputArray distCoeffs, InputOutputArray rvec, InputOutputArray tvec, bool useExtrinsicGuess=false, int flags=SOLVEPNP_ITERATIVE)']]], + ['findrtransac_275',['findRtRANSAC',['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#a2d22157c9b5f8ba7ee88abc1078d8223',1,'cv::ccalib::CustomPattern::findRtRANSAC(InputArray objectPoints, InputArray imagePoints, InputArray cameraMatrix, InputArray distCoeffs, InputOutputArray rvec, InputOutputArray tvec, bool useExtrinsicGuess=false, int iterationsCount=100, float reprojectionError=8.0, int minInliersCount=100, OutputArray inliers=noArray(), int flags=SOLVEPNP_ITERATIVE)'],['https://docs.opencv.org/4.2.0/d3/d3e/classcv_1_1ccalib_1_1CustomPattern.html#af10afe143eb9fe66755bf14f44a0ddb5',1,'cv::ccalib::CustomPattern::findRtRANSAC(InputArray image, InputArray cameraMatrix, InputArray distCoeffs, InputOutputArray rvec, InputOutputArray tvec, bool useExtrinsicGuess=false, int iterationsCount=100, float reprojectionError=8.0, int minInliersCount=100, OutputArray inliers=noArray(), int flags=SOLVEPNP_ITERATIVE)']]], + ['findsetbyelem_276',['findSetByElem',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#a4f61a6ddc6663de58ad177d5ab92d943',1,'cv::detail::DisjointSets']]], + ['findtransformecc_277',['findTransformECC',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga1aa357007eaec11e9ed03500ecbcbe47',1,'cv::findTransformECC(InputArray templateImage, InputArray inputImage, InputOutputArray warpMatrix, int motionType, TermCriteria criteria, InputArray inputMask, int gaussFiltSize)'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga7ded46f9a55c0364c92ccd2019d43e3a',1,'cv::findTransformECC(InputArray templateImage, InputArray inputImage, InputOutputArray warpMatrix, int motionType=MOTION_AFFINE, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 50, 0.001), InputArray inputMask=noArray())'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga1aa357007eaec11e9ed03500ecbcbe47',1,'findTransformECC(InputArray templateImage, InputArray inputImage, InputOutputArray warpMatrix, int motionType, TermCriteria criteria, InputArray inputMask, int gaussFiltSize)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga7ded46f9a55c0364c92ccd2019d43e3a',1,'findTransformECC(InputArray templateImage, InputArray inputImage, InputOutputArray warpMatrix, int motionType=MOTION_AFFINE, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 50, 0.001), InputArray inputMask=noArray())(Global Namespace)']]], + ['finish_278',['finish',['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#ad00e1adfb5e708624ed2685be06885fc',1,'cv::ocl::Queue::finish()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gabfca32247f267c662b3bff6587d14b40',1,'cv::ocl::finish()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#gabfca32247f267c662b3bff6587d14b40',1,'finish()(Global Namespace)']]], + ['finished_279',['finished',['https://eigen.tuxfamily.org/dox/structEigen_1_1CommaInitializer.html#a3cf9e2b8a227940f50103130b2d2859a',1,'Eigen::CommaInitializer']]], + ['finishwriteavi_280',['finishWriteAVI',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#aa51fe5ae4e23f88b3aeb43e72bc51714',1,'cv::AVIWriteContainer']]], + ['first_281',['first',['https://docs.opencv.org/4.2.0/dd/d1c/classcv_1_1gapi_1_1wip_1_1GCaptureSource.html#a3a21970aea469f6b388be220c20feaff',1,'cv::gapi::wip::GCaptureSource::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'__gnu_parallel::_IteratorPair::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< _Bi_iter, _Bi_iter >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< _BiIter, _BiIter >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< _Iterator1, _Iterator2 >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< _RAIter, _RAIter >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< char, _TokenT >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< char, char >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'pair< entry_pointer, typename _Alloc::size_type >::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'std::pair::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'std::sub_match::first'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html#a198b03cffc037835dc1dc01c926ce251',1,'sub_match< _Bi_iter >::first'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArithmeticSequence.html#a3b0d096fb8fad937f2a210217afc454b',1,'Eigen::ArithmeticSequence::first()']]], + ['first_5fargument_5ftype_282',['first_argument_type',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'cv::cudev::binary_function::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< double, double, double >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< float, float, float >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< Predicate::first_argument_type, Predicate::second_argument_type, Predicate::result_type >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< schar, schar, float >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< schar, schar, schar >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< short, short, float >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< short, short, short >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< T1, T2, T1 >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< T1, T2, T2 >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< uchar, uchar, float >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< uchar, uchar, uchar >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< uint, uint, float >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< uint, uint, uint >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< ushort, ushort, float >::first_argument_type'],['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html#af7e0b87fad00c320d7b2e271b4798e45',1,'binary_function< ushort, ushort, ushort >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_cxx::project1st::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_cxx::project2nd::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_EqualFromLess::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_EqualTo::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_Less::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_Lexicographic::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_LexicographicReverse::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_Multiplies::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'__gnu_parallel::_Plus::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< __shared_ptr< _Tp, _Lp >, __shared_ptr< _Tp, _Lp >, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< __weak_ptr< _Tp, _Lp >, __weak_ptr< _Tp, _Lp >, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Arg1, _Arg2, _Arg1 >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Arg1, _Arg2, _Arg2 >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Predicate::first_argument_type, _Predicate::second_argument_type, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _T1, _T2, _Res >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _T1, _T2, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Tp *, _Arg, _Ret >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Tp *, _Tp *, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Tp, _Arg, _Ret >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Tp, _Tp, _Tp >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Tp, _Tp, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< _Tp1, _Tp2, _Result >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< const _Tp *, _Arg, _Ret >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< rope< _CharT, _Alloc >, rope< _CharT, _Alloc >, rope< _CharT, _Alloc > >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< shared_ptr< _Tp >, shared_ptr< _Tp >, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< std::pair< _T1, _T2 >, std::pair< _T1, _T2 >, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< value_type, value_type, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< void, void, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'binary_function< weak_ptr< _Tp >, weak_ptr< _Tp >, bool >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::_Maybe_unary_or_binary_function< _Res, _T1, _T2 >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::binary_function::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::binary_negate::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::const_mem_fun1_ref_t::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::const_mem_fun1_t::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::divides::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::equal_to::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::experimental::fundamentals_v2::owner_less< shared_ptr< _Tp > >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::experimental::fundamentals_v2::owner_less< weak_ptr< _Tp > >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::greater::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::greater_equal::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::less::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::less_equal::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::logical_and::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::logical_or::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::mem_fun1_ref_t::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::mem_fun1_t::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::minus::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::modulus::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::multiplies::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::not_equal_to::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::owner_less< shared_ptr< _Tp > >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::owner_less< void >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::owner_less< weak_ptr< _Tp > >::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::plus::first_argument_type'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html#ad907337549df2e1a3c3dbca8e0693dba',1,'std::pointer_to_binary_function::first_argument_type']]], + ['first_5fobject_283',['first_object',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a0e039b5feca33a6d86ae8027408ae4cf',1,'cv::tbm::Track']]], + ['first_5fpulled_284',['first_pulled',['https://docs.opencv.org/4.2.0/dd/d1c/classcv_1_1gapi_1_1wip_1_1GCaptureSource.html#a097a5707f5b992ae3418ca0cb55c76fb',1,'cv::gapi::wip::GCaptureSource']]], + ['firstedge_285',['firstEdge',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a07bb3543d958161a1916c4c942df1626',1,'cv::Subdiv2D::Vertex']]], + ['fisher_5ff_5fdistribution_286',['fisher_f_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html',1,'std']]], + ['fisherfacerecognizer_287',['FisherFaceRecognizer',['https://docs.opencv.org/4.2.0/d2/de9/classcv_1_1face_1_1FisherFaceRecognizer.html',1,'cv::face']]], + ['fisheye_20camera_20model_288',['Fisheye camera model',['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html',1,'']]], + ['fisheyeprojector_289',['FisheyeProjector',['https://docs.opencv.org/4.2.0/d9/de9/structcv_1_1detail_1_1FisheyeProjector.html',1,'cv::detail']]], + ['fisheyewarper_290',['FisheyeWarper',['https://docs.opencv.org/4.2.0/d9/dac/classcv_1_1detail_1_1FisheyeWarper.html',1,'cv::detail::FisheyeWarper'],['https://docs.opencv.org/4.2.0/d5/d30/classcv_1_1FisheyeWarper.html',1,'cv::FisheyeWarper'],['https://docs.opencv.org/4.2.0/d9/dac/classcv_1_1detail_1_1FisheyeWarper.html#ad67ecc3a118fc6025ef308852f46b63c',1,'cv::detail::FisheyeWarper::FisheyeWarper()']]], + ['fist_291',['fist',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga82775e152f8a74c5fe06f5a7343e0233a96440bcf7f90afff850728efd5aabf56',1,'cv::datasets::fist'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga82775e152f8a74c5fe06f5a7343e0233a96440bcf7f90afff850728efd5aabf56',1,'fist(Global Namespace)']]], + ['fit_292',['fit',['https://docs.opencv.org/4.2.0/db/dd8/classcv_1_1face_1_1Facemark.html#a9c21865859a685d16746f0097e9b3d26',1,'cv::face::Facemark']]], + ['fitconfig_293',['fitConfig',['https://docs.opencv.org/4.2.0/d5/d7b/classcv_1_1face_1_1FacemarkAAM.html#a4c72f54aecf28a11b6d01a8ddce6e01d',1,'cv::face::FacemarkAAM']]], + ['fitellipse_294',['fitEllipse',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf259efaad93098103d6c27b9e4900ffa',1,'cv::fitEllipse()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf259efaad93098103d6c27b9e4900ffa',1,'fitEllipse()(Global Namespace)']]], + ['fitellipseams_295',['fitEllipseAMS',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga69e90cda55c4e192a8caa0b99c3e4550',1,'cv::fitEllipseAMS()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga69e90cda55c4e192a8caa0b99c3e4550',1,'fitEllipseAMS()(Global Namespace)']]], + ['fitellipsedirect_296',['fitEllipseDirect',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga6421884fd411923a74891998bbe9e813',1,'cv::fitEllipseDirect()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga6421884fd411923a74891998bbe9e813',1,'fitEllipseDirect()(Global Namespace)']]], + ['fitline_297',['fitLine',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf849da1fdafa67ee84b1e9a23b93f91f',1,'cv::fitLine()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaf849da1fdafa67ee84b1e9a23b93f91f',1,'fitLine()(Global Namespace)']]], + ['fix_298',['fix',['https://eigen.tuxfamily.org/dox/group__Core__Module.html#gac01f234bce100e39e6928fdc470e5194',1,'Eigen::fix()'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html#ga3ce50da8ca83238949c06afce1a4f3c7',1,'Eigen::fix(int val)'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html#gac01f234bce100e39e6928fdc470e5194',1,'fix()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html#ga3ce50da8ca83238949c06afce1a4f3c7',1,'fix(int val)(Global Namespace)']]], + ['fixcamerayawaxis_299',['fixCameraYawAxis',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#a3df77148958eb408d7e7d16e30ffc244',1,'cv::ovis::WindowScene']]], + ['fixed_300',['fixed',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_ios< char, _Traits >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_iostream< char >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_istream< char >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_istream< char, _Traits >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_ostream< char >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_ostream< char, _Traits >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_fstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ifstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ios::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_iostream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_istream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_istringstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ofstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ostream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ostringstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_stringstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::ios_base::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af52d7537a34e913e7fb3f0ec2f27a8f2',1,'std::fixed()']]], + ['fixed_20size_20vectorizable_20eigen_20objects_301',['Fixed-size vectorizable Eigen objects',['https://eigen.tuxfamily.org/dox/group__TopicFixedSizeVectorizable.html',1,'']]], + ['fixed_5fsize_302',['FIXED_SIZE',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba4eb3928003c50a19e08aebee36ed3a7e',1,'cv::_InputArray']]], + ['fixed_5ftype_303',['FIXED_TYPE',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba517c23e91976c6c72e6cb025fae551aa',1,'cv::_InputArray']]], + ['fixedsize_304',['fixedSize',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ab8b119e910915d4d39317994750f2e35',1,'cv::_OutputArray']]], + ['fixedtype_305',['fixedType',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#a2aa22d85b6a332142c3767a09297e1c2',1,'cv::_OutputArray']]], + ['flagged_306',['flagged',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae5815e87ecd984879138601e24f56422',1,'Eigen::DenseBase::flagged()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae5815e87ecd984879138601e24f56422',1,'DenseBase< ArrayWrapper< ExpressionType > >::flagged()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae5815e87ecd984879138601e24f56422',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::flagged()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ae5815e87ecd984879138601e24f56422',1,'DenseBase< Solve< Decomposition, RhsType > >::flagged()']]], + ['flags_307',['FLAGS',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612',1,'cv::instr']]], + ['flags_308',['Flags',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a7afa5cd2289fb88989c0ab1b8b5d8ac2',1,'cv::ml::DTrees::Flags'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#ae8a94a2add0555b0414e85c08ff67f50',1,'cv::PCA::Flags'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af1ea864e1c19796e6264ebb3950c0b9a',1,'cv::ml::StatModel::Flags'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a4700f5207e66cdd9924bf64e34911832',1,'cv::SVD::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'Eigen::DenseBase::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'DenseBase< ArrayWrapper< ExpressionType > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'DenseBase< Solve< Decomposition, RhsType > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'Eigen::SparseMatrixBase::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< Transpose< MatrixType > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::Flags'],['https://eigen.tuxfamily.org/dox/group__flags.html',1,'Flags']]], + ['flags_309',['flags',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#af3be19723301164bb9932133f550149f',1,'cv::_InputArray::flags'],['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#aa0a8079aa21df8ab4d8fd7769eedf79a',1,'cv::BOWKMeansTrainer::flags'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#adfd242b365e79ebc382a0829d8e9f44f',1,'cv::cuda::GpuMat::flags'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#af81a4ce11a420f2905f7666d5545c674',1,'cv::cuda::HostMem::flags'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a6c2adb1ffd71913a3c37ea4f0e0583f5',1,'cv::ocl::KernelArg::flags'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af9333f06c84f115fda4cdf3af18c2ad0',1,'cv::Mat::flags'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a039a50c85f8475f06e3aecb9fb9b0f0c',1,'cv::MatExpr::flags'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a94a639f4af82b43e32307b34b28a8193',1,'cv::gapi::own::detail::MatHeader::flags'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ad5f261bc8c1330e4e516684861410cd2',1,'cv::SparseMat::flags'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ad662d8ae2354913ddee4374cb5a86808',1,'cv::UMat::flags'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#abd20502f4de49d5bf2fe2147d3f49d83',1,'cv::UMatData::flags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'basic_ios< char, _Traits >::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'basic_ios< char, _Traits >::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'basic_iostream< char >::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'basic_iostream< char >::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'basic_istream< char >::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'basic_istream< char >::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'basic_istream< char, _Traits >::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'basic_istream< char, _Traits >::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'basic_ostream< char >::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'basic_ostream< char >::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'basic_ostream< char, _Traits >::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'basic_ostream< char, _Traits >::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_fstream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_fstream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_ifstream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_ifstream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_ios::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_ios::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_iostream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_iostream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_istream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_istream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_istringstream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_istringstream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_ofstream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_ofstream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_ostream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_ostream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_ostringstream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_ostringstream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#ac3473fa27e545da4b9d74eb61fa72401',1,'std::basic_regex::flags()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::basic_stringstream::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::basic_stringstream::flags(fmtflags __fmtfl)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7bdbad6d382502ee581ce65a3e21d8d1',1,'std::ios_base::flags() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a415eb7181eb10a21c92455e1fae17cec',1,'std::ios_base::flags(fmtflags __fmtfl)']]], + ['flags_20for_20video_20i_20o_310',['Flags for video I/O',['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html',1,'']]], + ['flags_20for_20video_20i_20o_20api_20backends_311',['Additional flags for video I/O API backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'']]], + ['flags2idx_312',['flags2idx',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#ac11b28b72254863b09873d0dd9e115ef',1,'cv::omnidir::internal']]], + ['flags2idxstereo_313',['flags2idxStereo',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a5d0af87fbd3e0639376713687b02f98e',1,'cv::omnidir::internal']]], + ['flags_5fexpand_5fsame_5fnames_314',['FLAGS_EXPAND_SAME_NAMES',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612a0f3b3d3a281bf899e129650268314e8f',1,'cv::instr']]], + ['flags_5fmapping_315',['FLAGS_MAPPING',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612a2179656df5cb2d063fc7d4cd7832c674',1,'cv::instr']]], + ['flags_5fnone_316',['FLAGS_NONE',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612a7cb3d7e2fb9323ea58c26d71b0b5ad41',1,'cv::instr']]], + ['flann_317',['Feature Matching with FLANN',['https://docs.opencv.org/4.2.0/d5/d6f/tutorial_feature_flann_matcher.html',1,'']]], + ['flann_2ehpp_318',['flann.hpp',['https://docs.opencv.org/4.2.0/d4/d45/flann_2flann_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/dc1/flann_8hpp.html',1,'(Global Namespace)']]], + ['flann_5fbase_2ehpp_319',['flann_base.hpp',['https://docs.opencv.org/4.2.0/d3/dd7/flann__base_8hpp.html',1,'']]], + ['flann_5fdistance_5ftype_320',['flann_distance_type',['https://docs.opencv.org/4.2.0/dc/d8c/namespacecvflann.html#acefb2bb801db2e24fa23e3d3a0b11585',1,'cvflann']]], + ['flannbased_321',['FLANNBASED',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#af8b6f4acb8f1a9ea6b73bfcb86b80c3baf73d671c6860c24f44b2880a77fadcdc',1,'cv::DescriptorMatcher']]], + ['flannbasedmatcher_322',['FlannBasedMatcher',['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html',1,'cv::FlannBasedMatcher'],['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#ab9114a6471e364ad221f89068ca21382',1,'cv::FlannBasedMatcher::FlannBasedMatcher(const Ptr< flann::IndexParams > &indexParams=makePtr< flann::KDTreeIndexParams >(), const Ptr< flann::SearchParams > &searchParams=makePtr< flann::SearchParams >())']]], + ['flannindex_323',['flannIndex',['https://docs.opencv.org/4.2.0/dc/de2/classcv_1_1FlannBasedMatcher.html#a293108def96df8a5f19ea0897e548ff2',1,'cv::FlannBasedMatcher']]], + ['flat_324',['flat',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga82775e152f8a74c5fe06f5a7343e0233a6306dd1c0bf0644fbae4ca9083032da9',1,'cv::datasets::flat'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga82775e152f8a74c5fe06f5a7343e0233a6306dd1c0bf0644fbae4ca9083032da9',1,'flat(Global Namespace)']]], + ['flatten_325',['flatten',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab7aa6e048e659481a036f2d872c7cba6.html#ab7aa6e048e659481a036f2d872c7cba6',1,'nlohmann::basic_json']]], + ['flatten_5fg_326',['flatten_g',['https://docs.opencv.org/4.2.0/dd/d3b/structcv_1_1detail_1_1flatten__g.html',1,'cv::detail']]], + ['flatten_5fg_3c_20cv_3a_3agmat_20_3e_327',['flatten_g< cv::GMat >',['https://docs.opencv.org/4.2.0/df/de8/structcv_1_1detail_1_1flatten__g_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], + ['flatten_5fg_3c_20cv_3a_3agscalar_20_3e_328',['flatten_g< cv::GScalar >',['https://docs.opencv.org/4.2.0/d5/d97/structcv_1_1detail_1_1flatten__g_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], + ['flattenlayer_329',['FlattenLayer',['https://docs.opencv.org/4.2.0/d4/da3/classcv_1_1dnn_1_1FlattenLayer.html',1,'cv::dnn']]], + ['flip_330',['flip',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a74c7d5b72d4bdc578f796f6f382b7b76',1,'std::bitset::flip() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac1664aa3a88a766504c14fa38c824522',1,'std::bitset::flip(size_t __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aaab99f0e8e5208a515482e4b549f4dc9',1,'std::tr2::dynamic_bitset::flip()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a53285bcbf85cc3b61ebbc6a6360aafe3',1,'std::tr2::dynamic_bitset::flip(size_type __pos)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaca7be533e3dac7feb70fc60635adf441',1,'cv::flip()'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga4d0a3f2b46e8f0f1ec2b5ac178dcd871',1,'cv::cuda::flip()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaa5d151bf720b9e4186ca3d415dc879c7',1,'cv::gapi::flip()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaca7be533e3dac7feb70fc60635adf441',1,'flip(InputArray src, OutputArray dst, int flipCode)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaa5d151bf720b9e4186ca3d415dc879c7',1,'flip(const GMat &src, int flipCode)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga4d0a3f2b46e8f0f1ec2b5ac178dcd871',1,'flip(InputArray src, OutputArray dst, int flipCode, Stream &stream=Stream::Null())(Global Namespace)']]], + ['float_331',['FLOAT',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45abaa6f858f3ef3a2735b6ef8016d3bb3e',1,'cv::FileNode::FLOAT'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aae738c26bf4ce1037fa81b039a915cbf6',1,'FLOAT(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aae738c26bf4ce1037fa81b039a915cbf6',1,'FLOAT(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga8af2ae1e077644d1dd232d29d988b79aae738c26bf4ce1037fa81b039a915cbf6',1,'FLOAT(Global Namespace)']]], + ['float16_5ft_332',['float16_t',['https://docs.opencv.org/4.2.0/df/dc9/classcv_1_1float16__t.html',1,'cv::float16_t'],['https://docs.opencv.org/4.2.0/df/dc9/classcv_1_1float16__t.html#ad18d9740ade824e6fc60a045a74b9db7',1,'cv::float16_t::float16_t()'],['https://docs.opencv.org/4.2.0/df/dc9/classcv_1_1float16__t.html#a7f071717a3caa0042fbe23a8e7783e7b',1,'cv::float16_t::float16_t(float x)']]], + ['float_5fdenorm_5fstyle_333',['float_denorm_style',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d4e3dd02abab45dde95b5bb4ae7fdbf',1,'std']]], + ['float_5fround_5fstyle_334',['float_round_style',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53dbc8572a84ca50272f9e55a1e23e18',1,'std']]], + ['float_5ftype_335',['float_type',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a2730bcb4f97187be1ceda0a58994bb53',1,'cv::Affine3::float_type'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a2730bcb4f97187be1ceda0a58994bb53',1,'Affine3< float >::float_type']]], + ['floatfield_336',['floatfield',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'basic_ios< char, _Traits >::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'basic_iostream< char >::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'basic_istream< char >::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'basic_istream< char, _Traits >::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'basic_ostream< char >::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'basic_ostream< char, _Traits >::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_fstream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_ifstream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_ios::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_iostream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_istream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_istringstream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_ofstream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_ostream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_ostringstream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::basic_stringstream::floatfield'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a82663733691c649e8138a0fa959cb8c4',1,'std::ios_base::floatfield']]], + ['floating_20point_20arithmetic_337',['Decimal Floating-Point Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01520.html',1,'']]], + ['floattype_338',['FloatType',['https://docs.opencv.org/4.2.0/d8/d4e/structcv_1_1cudev_1_1functional__detail_1_1FloatType.html',1,'cv::cudev::functional_detail']]], + ['floodfill_339',['floodFill',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaf1f55a048f8a45bc3383586e80b1f0d0',1,'cv::floodFill(InputOutputArray image, Point seedPoint, Scalar newVal, Rect *rect=0, Scalar loDiff=Scalar(), Scalar upDiff=Scalar(), int flags=4)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga366aae45a6c1289b341d140839f18717',1,'cv::floodFill(InputOutputArray image, InputOutputArray mask, Point seedPoint, Scalar newVal, Rect *rect=0, Scalar loDiff=Scalar(), Scalar upDiff=Scalar(), int flags=4)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gaf1f55a048f8a45bc3383586e80b1f0d0',1,'floodFill(InputOutputArray image, Point seedPoint, Scalar newVal, Rect *rect=0, Scalar loDiff=Scalar(), Scalar upDiff=Scalar(), int flags=4)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ga366aae45a6c1289b341d140839f18717',1,'floodFill(InputOutputArray image, InputOutputArray mask, Point seedPoint, Scalar newVal, Rect *rect=0, Scalar loDiff=Scalar(), Scalar upDiff=Scalar(), int flags=4)(Global Namespace)']]], + ['floodfill_5ffixed_5frange_340',['FLOODFILL_FIXED_RANGE',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggab87810a476a9cb660435a4cd7871c9eba8aafb7a6a87df91c7624d44f4b092fe3',1,'cv::FLOODFILL_FIXED_RANGE'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggab87810a476a9cb660435a4cd7871c9eba8aafb7a6a87df91c7624d44f4b092fe3',1,'FLOODFILL_FIXED_RANGE(Global Namespace)']]], + ['floodfill_5fmask_5fonly_341',['FLOODFILL_MASK_ONLY',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggab87810a476a9cb660435a4cd7871c9eba7161dca1d0b9e84e5208c7e8021b4d3a',1,'cv::FLOODFILL_MASK_ONLY'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggab87810a476a9cb660435a4cd7871c9eba7161dca1d0b9e84e5208c7e8021b4d3a',1,'FLOODFILL_MASK_ONLY(Global Namespace)']]], + ['floodfillflags_342',['FloodFillFlags',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gab87810a476a9cb660435a4cd7871c9eb',1,'cv::FloodFillFlags'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gab87810a476a9cb660435a4cd7871c9eb',1,'FloodFillFlags(Global Namespace)']]], + ['floor_343',['floor',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#abf03d773a87830bc7fde51bcd94c89a0',1,'Eigen']]], + ['floord_344',['floord',['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a9a5f3e924d9d2b8c8de768bc3895c68b',1,'cv::gapi::own']]], + ['flow_345',['FLOW',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a6341540fa16ae64960926d977ecba81c',1,'cv::FileNode']]], + ['flow_346',['Flow',['https://docs.opencv.org/4.2.0/d7/d3f/group__cudaoptflow.html',1,'Optical Flow'],['https://docs.opencv.org/4.2.0/d4/dee/tutorial_optical_flow.html',1,'Optical Flow'],['https://docs.opencv.org/4.2.0/d7/d8b/tutorial_py_lucas_kanade.html',1,'Optical Flow'],['https://docs.opencv.org/4.2.0/db/d7f/tutorial_js_lucas_kanade.html',1,'Optical Flow']]], + ['flow_20algorithms_347',['Optical Flow Algorithms',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html',1,'']]], + ['flowerrorthreshold_348',['flowErrorThreshold',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#a984ec65a4e029e6ca2e3205ba2f3ffd9',1,'cv::videostab::MotionInpainter']]], + ['fluid_5fget_5fin_349',['fluid_get_in',['https://docs.opencv.org/4.2.0/d3/d36/structcv_1_1detail_1_1fluid__get__in.html',1,'cv::detail']]], + ['fluid_5fget_5fin_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_350',['fluid_get_in< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/d1/dde/structcv_1_1detail_1_1fluid__get__in_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], + ['fluid_5fget_5fin_3c_20cv_3a_3agmat_20_3e_351',['fluid_get_in< cv::GMat >',['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1detail_1_1fluid__get__in_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], + ['fluid_5fget_5fin_3c_20cv_3a_3agscalar_20_3e_352',['fluid_get_in< cv::GScalar >',['https://docs.opencv.org/4.2.0/d8/de3/structcv_1_1detail_1_1fluid__get__in_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], + ['fluidcallhelper_353',['FluidCallHelper',['https://docs.opencv.org/4.2.0/d6/daf/structcv_1_1detail_1_1FluidCallHelper.html',1,'cv::detail']]], + ['fluidcallhelper_3c_20impl_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20outs_2e_2e_2e_20_3e_2c_20usescratch_20_3e_354',['FluidCallHelper< Impl, std::tuple< Ins... >, std::tuple< Outs... >, UseScratch >',['https://docs.opencv.org/4.2.0/d4/d77/structcv_1_1detail_1_1FluidCallHelper_3_01Impl_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_16cb3b081e952d44068dce53ded07afdc.html',1,'cv::detail']]], + ['flush_355',['flush',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'basic_iostream< char >::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'basic_ostream< char >::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'basic_ostream< char, _Traits >::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'std::basic_fstream::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'std::basic_iostream::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'std::basic_ofstream::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'std::basic_ostream::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'std::basic_ostringstream::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ab5155ad385b78192ef1436bf31a0cde0',1,'std::basic_stringstream::flush()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8b74d0bc34dda8d29dd0950b4e5e661d',1,'std::flush()']]], + ['fm_5f7point_356',['FM_7POINT',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02a8ccd232f3e7691efae984c76bb99e047',1,'cv::FM_7POINT'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02a8ccd232f3e7691efae984c76bb99e047',1,'FM_7POINT(Global Namespace)']]], + ['fm_5f8point_357',['FM_8POINT',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02a3960f8c87052a64c3297704db34aaedf',1,'cv::FM_8POINT'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02a3960f8c87052a64c3297704db34aaedf',1,'FM_8POINT(Global Namespace)']]], + ['fm_5flmeds_358',['FM_LMEDS',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02a8a81ff35b40a5de086bc91dbc1ef8bba',1,'cv::FM_LMEDS'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02a8a81ff35b40a5de086bc91dbc1ef8bba',1,'FM_LMEDS(Global Namespace)']]], + ['fm_5fransac_359',['FM_RANSAC',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02aeb30cc6b8fc94600bc04f16c14644fdd',1,'cv::FM_RANSAC'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggae515fd11d4c0e5b4162440eaf2094e02aeb30cc6b8fc94600bc04f16c14644fdd',1,'FM_RANSAC(Global Namespace)']]], + ['fmt_360',['fmt',['https://docs.opencv.org/4.2.0/d7/d0e/classcv_1_1DataDepth.html#a022386121e1e1241c5a999976d4b5956ae5030288b4884074c6dd94c287ab31ba',1,'cv::DataDepth']]], + ['fmt_5fc_361',['FMT_C',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08eadf3c07708afbb7a0abfef260f9e71251',1,'cv::Formatter']]], + ['fmt_5fcsv_362',['FMT_CSV',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08ea1582de9020e4f0f01adedadc257315a8',1,'cv::Formatter']]], + ['fmt_5fdefault_363',['FMT_DEFAULT',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08eafa0150ad2e95a3657487ba482d0e6457',1,'cv::Formatter']]], + ['fmt_5fmatlab_364',['FMT_MATLAB',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08eac296692aec2ddf485727c6458e95c30d',1,'cv::Formatter']]], + ['fmt_5fnumpy_365',['FMT_NUMPY',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08ea945acfdf2a741d281b25d566aff8e330',1,'cv::Formatter']]], + ['fmt_5fpython_366',['FMT_PYTHON',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08ead7aff265f8074ea43014e2b4199faaa3',1,'cv::Formatter']]], + ['fmtflags_367',['fmtflags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'basic_ios< char, _Traits >::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'basic_iostream< char >::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'basic_istream< char >::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'basic_istream< char, _Traits >::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'basic_ostream< char >::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'basic_ostream< char, _Traits >::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_fstream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_ifstream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_ios::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_iostream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_istream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_istringstream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_ofstream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_ostream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_ostringstream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::basic_stringstream::fmtflags'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a03fbf244b3dfb55651c7460537abb89e',1,'std::ios_base::fmtflags']]], + ['fn_5ffacedetector_368',['FN_FaceDetector',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gae0bc3cfe0eb0cccde1fc0d91c6cde9db',1,'cv::face::FN_FaceDetector'],['https://docs.opencv.org/4.2.0/db/d7c/group__face.html#gae0bc3cfe0eb0cccde1fc0d91c6cde9db',1,'FN_FaceDetector(Global Namespace)']]], + ['focal_369',['focal',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#a9af414e5bbf7063c105ce8c9a2ec36ba',1,'cv::detail::CameraParams']]], + ['focal_5flength_5fx_370',['focal_length_x',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a175a0ace6e27a419e26ec948e69f024c',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['focal_5flength_5fy_371',['focal_length_y',['https://docs.opencv.org/4.2.0/d9/d5a/classcv_1_1sfm_1_1libmv__CameraIntrinsicsOptions.html#a5b35252bf045707640b06b9ba3fd6e04',1,'cv::sfm::libmv_CameraIntrinsicsOptions']]], + ['focalsfromhomography_372',['focalsFromHomography',['https://docs.opencv.org/4.2.0/d4/dbc/group__stitching__autocalib.html#ga0d78f56152790435703b556e0f5840f1',1,'cv::detail::focalsFromHomography()'],['https://docs.opencv.org/4.2.0/d4/dbc/group__stitching__autocalib.html#ga0d78f56152790435703b556e0f5840f1',1,'focalsFromHomography(const Mat &H, double &f0, double &f1, bool &f0_ok, bool &f1_ok)(Global Namespace)']]], + ['focus_20deblur_20filter_373',['Out-of-focus Deblur Filter',['https://docs.opencv.org/4.2.0/de/d3c/tutorial_out_of_focus_deblur_filter.html',1,'']]], + ['font_5fface_374',['font_face',['https://docs.opencv.org/4.2.0/d2/dbf/structcv_1_1QtFont.html#ad839059de1e0b7fdba986f04a1c923db',1,'cv::QtFont']]], + ['font_5fhershey_5fcomplex_375',['FONT_HERSHEY_COMPLEX',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11af7b1b25521fc9b5731a97cfd13460c2a',1,'cv::FONT_HERSHEY_COMPLEX'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11af7b1b25521fc9b5731a97cfd13460c2a',1,'FONT_HERSHEY_COMPLEX(Global Namespace)']]], + ['font_5fhershey_5fcomplex_5fsmall_376',['FONT_HERSHEY_COMPLEX_SMALL',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11adfd28fc57520df956e00c7a26fb718ed',1,'cv::FONT_HERSHEY_COMPLEX_SMALL'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11adfd28fc57520df956e00c7a26fb718ed',1,'FONT_HERSHEY_COMPLEX_SMALL(Global Namespace)']]], + ['font_5fhershey_5fduplex_377',['FONT_HERSHEY_DUPLEX',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11ab307bdc73fdd06074acad940115bda7a',1,'cv::FONT_HERSHEY_DUPLEX'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11ab307bdc73fdd06074acad940115bda7a',1,'FONT_HERSHEY_DUPLEX(Global Namespace)']]], + ['font_5fhershey_5fplain_378',['FONT_HERSHEY_PLAIN',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a08cf3b0a37729fbb62a3007d499cbd8b',1,'cv::FONT_HERSHEY_PLAIN'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a08cf3b0a37729fbb62a3007d499cbd8b',1,'FONT_HERSHEY_PLAIN(Global Namespace)']]], + ['font_5fhershey_5fscript_5fcomplex_379',['FONT_HERSHEY_SCRIPT_COMPLEX',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a8e7f6a22d4aec98c59375649eee1c696',1,'cv::FONT_HERSHEY_SCRIPT_COMPLEX'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a8e7f6a22d4aec98c59375649eee1c696',1,'FONT_HERSHEY_SCRIPT_COMPLEX(Global Namespace)']]], + ['font_5fhershey_5fscript_5fsimplex_380',['FONT_HERSHEY_SCRIPT_SIMPLEX',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a58de14ee43572b502c8cb71f788e9fdc',1,'cv::FONT_HERSHEY_SCRIPT_SIMPLEX'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a58de14ee43572b502c8cb71f788e9fdc',1,'FONT_HERSHEY_SCRIPT_SIMPLEX(Global Namespace)']]], + ['font_5fhershey_5fsimplex_381',['FONT_HERSHEY_SIMPLEX',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11afff8b973668df2e4028dddc5274310c9',1,'cv::FONT_HERSHEY_SIMPLEX'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11afff8b973668df2e4028dddc5274310c9',1,'FONT_HERSHEY_SIMPLEX(Global Namespace)']]], + ['font_5fhershey_5ftriplex_382',['FONT_HERSHEY_TRIPLEX',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a2880034c653349b7f9fcc2bb60342fc6',1,'cv::FONT_HERSHEY_TRIPLEX'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11a2880034c653349b7f9fcc2bb60342fc6',1,'FONT_HERSHEY_TRIPLEX(Global Namespace)']]], + ['font_5fitalic_383',['FONT_ITALIC',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11af0f7c8824fe42205076771a7b67661c2',1,'cv::FONT_ITALIC'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#gga0f9314ea6e35f99bb23f29567fc16e11af0f7c8824fe42205076771a7b67661c2',1,'FONT_ITALIC(Global Namespace)']]], + ['font_5fsize_384',['FONT_SIZE',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca58e5b5d44537f61d9b5d590ca4c3c28f',1,'cv::viz::FONT_SIZE'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8aca58e5b5d44537f61d9b5d590ca4c3c28f',1,'FONT_SIZE(Global Namespace)']]], + ['fontqt_385',['fontQt',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga6281d0939583c9e0ee36372dfeb52ae3',1,'cv::fontQt()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#ga6281d0939583c9e0ee36372dfeb52ae3',1,'fontQt(const String &nameFont, int pointSize=-1, Scalar color=Scalar::all(0), int weight=QT_FONT_NORMAL, int style=QT_STYLE_NORMAL, int spacing=0)(Global Namespace)']]], + ['for_203d_20object_20classification_20and_20pose_20estimation_386',['CNN for 3D Object Classification and Pose Estimation',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_table_of_content_cnn_3dobj.html',1,'']]], + ['for_203d_20reconstruction_387',['Custom Calibration Pattern for 3D reconstruction',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html',1,'']]], + ['for_20arm_20based_20linux_20systems_388',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]], + ['for_20bgsegm_20module_389',['Tutorials for bgsegm module',['https://docs.opencv.org/4.2.0/d3/d89/tutorial_table_of_content_bgsegm.html',1,'']]], + ['for_20contours_390',['for contours',['https://docs.opencv.org/4.2.0/da/d0c/tutorial_bounding_rects_circles.html',1,'Creating Bounding boxes and circles for contours'],['https://docs.opencv.org/4.2.0/de/d62/tutorial_bounding_rotated_ellipses.html',1,'Creating Bounding rotated boxes and ellipses for contours']]], + ['for_20contrib_20modules_391',['Tutorials for contrib modules',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_contrib_root.html',1,'']]], + ['for_20corner_20detection_392',['FAST Algorithm for Corner Detection',['https://docs.opencv.org/4.2.0/df/d0c/tutorial_py_fast.html',1,'']]], + ['for_20efficient_20image_20segmentation_393',['Hierarchical Feature Selection for Efficient Image Segmentation',['https://docs.opencv.org/4.2.0/dc/d29/group__hfs.html',1,'']]], + ['for_20external_20libraries_20plugins_394',['Low-level API for external libraries / plugins',['https://docs.opencv.org/4.2.0/da/dd2/group__core__lowlevel__api.html',1,'']]], + ['for_20face_20module_395',['Tutorials for face module',['https://docs.opencv.org/4.2.0/de/d27/tutorial_table_of_content_face.html',1,'']]], + ['for_20fast_20edge_20detection_396',['for fast edge detection',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html',1,'Structured forests for fast edge detection'],['https://docs.opencv.org/4.2.0/d0/da5/tutorial_ximgproc_prediction.html',1,'Structured forests for fast edge detection']]], + ['for_20halide_20backend_397',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], + ['for_20image_20processing_398',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], + ['for_20improve_20efficiency_399',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], + ['for_20interactive_20visual_20debugging_20of_20computer_20vision_20programs_400',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], + ['for_20lines_20extracted_20from_20an_20image_401',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], + ['for_20mat_20data_402',['Plot function for Mat data',['https://docs.opencv.org/4.2.0/db/dfe/group__plot.html',1,'']]], + ['for_20new_20layers_20registration_403',['Utilities for New Layers Registration',['https://docs.opencv.org/4.2.0/df/dc1/group__dnnLayerFactory.html',1,'']]], + ['for_20non_20linearly_20separable_20data_404',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], + ['for_20object_20detection_405',['DNN used for object detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'']]], + ['for_20opencv_406',['Writing documentation for OpenCV',['https://docs.opencv.org/4.2.0/d4/db1/tutorial_documentation.html',1,'']]], + ['for_20opencv_20samples_407',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]], + ['for_20pointers_20to_20functions_408',['Adaptors for pointers to functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html',1,'']]], + ['for_20pointers_20to_20members_409',['Adaptors for pointers to members',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01511.html',1,'']]], + ['for_20sparse_20matrices_410',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], + ['for_20super_20resolution_411',['DNN used for super resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'']]], + ['for_20tegra_20with_20cuda_412',['Building OpenCV for Tegra with CUDA',['https://docs.opencv.org/4.2.0/d6/d15/tutorial_building_tegra_cuda.html',1,'']]], + ['for_20video_20capture_413',['Image Processing for Video Capture',['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'']]], + ['for_20video_20i_20o_414',['for video I O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__c.html',1,'C API for video I/O'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html',1,'Flags for video I/O'],['https://docs.opencv.org/4.2.0/d5/d26/group__videoio__ios.html',1,'iOS glue for video I/O'],['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html',1,'WinRT glue for video I/O']]], + ['for_20video_20i_20o_20api_20backends_415',['Additional flags for video I/O API backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'']]], + ['for_20working_20with_20different_20datasets_416',['Framework for working with different datasets',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html',1,'']]], + ['for_5feach_417',['for_each',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga36d3b88a382b4ad3bf55aff3f597522d',1,'std::for_each()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga36d3b88a382b4ad3bf55aff3f597522d',1,'for_each(_InputIterator __first, _InputIterator __last, _Function __f)(Global Namespace)']]], + ['for_5feach_2eh_418',['for_each.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00902.html',1,'']]], + ['for_5feach_5fminimal_5fn_419',['for_each_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a334f583634130237ff56881c3e3e9570',1,'__gnu_parallel::_Settings']]], + ['for_5feach_5fselectors_2eh_420',['for_each_selectors.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00905.html',1,'']]], + ['forcealignedaccess_421',['ForceAlignedAccess',['https://eigen.tuxfamily.org/dox/classEigen_1_1ForceAlignedAccess.html',1,'Eigen']]], + ['forcealignedaccess_422',['forceAlignedAccess',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb6e1b10c5f3d130100089dca3c5ee06',1,'Eigen::MatrixBase::forceAlignedAccess()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb6e1b10c5f3d130100089dca3c5ee06',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::forceAlignedAccess()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb6e1b10c5f3d130100089dca3c5ee06',1,'MatrixBase< Solve< Decomposition, RhsType > >::forceAlignedAccess()']]], + ['forcealignedaccessif_423',['forceAlignedAccessIf',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae35213d1dd4dd13ebe9a7a762d6bb847',1,'Eigen::MatrixBase::forceAlignedAccessIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#af42d92f115d4b8fa3d5aa731ed496ed1',1,'Eigen::MatrixBase::forceAlignedAccessIf() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae35213d1dd4dd13ebe9a7a762d6bb847',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::forceAlignedAccessIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#af42d92f115d4b8fa3d5aa731ed496ed1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::forceAlignedAccessIf() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae35213d1dd4dd13ebe9a7a762d6bb847',1,'MatrixBase< Solve< Decomposition, RhsType > >::forceAlignedAccessIf()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#af42d92f115d4b8fa3d5aa731ed496ed1',1,'MatrixBase< Solve< Decomposition, RhsType > >::forceAlignedAccessIf() const']]], + ['forced_5ferror_424',['forced_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10675.html',1,'__gnu_cxx']]], + ['forceidr_425',['ForceIDR',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#aa968a810ecec3b6cbc50e4f930b5f83f',1,'cv::cudacodec::EncoderParams']]], + ['forceintra_426',['ForceIntra',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a9becd1f21a6b0d550117f366fe748abb',1,'cv::cudacodec::EncoderParams']]], + ['foreach_427',['forEach',['https://docs.opencv.org/4.2.0/dc/d4c/classcv_1_1detail_1_1Graph.html#ae240a8d6ee21deaee7617e459597b042',1,'cv::detail::Graph::forEach()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a952ef1a85d70a510240cb645a90efc0d',1,'cv::Mat::forEach(const Functor &operation)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#afcee31e71fd6991148fd3bb619971e2b',1,'cv::Mat::forEach(const Functor &operation) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5ed4d525bbaf681c0885e9d059b81a75',1,'cv::Mat_::forEach(const Functor &operation)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3bc25901f088bb64e866240c969def60',1,'cv::Mat_::forEach(const Functor &operation) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5ed4d525bbaf681c0885e9d059b81a75',1,'Mat_< double >::forEach(const Functor &operation)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3bc25901f088bb64e866240c969def60',1,'Mat_< double >::forEach(const Functor &operation) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5ed4d525bbaf681c0885e9d059b81a75',1,'Mat_< float >::forEach(const Functor &operation)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3bc25901f088bb64e866240c969def60',1,'Mat_< float >::forEach(const Functor &operation) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5ed4d525bbaf681c0885e9d059b81a75',1,'Mat_< uchar >::forEach(const Functor &operation)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3bc25901f088bb64e866240c969def60',1,'Mat_< uchar >::forEach(const Functor &operation) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5ed4d525bbaf681c0885e9d059b81a75',1,'Mat_< unsigned char >::forEach(const Functor &operation)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3bc25901f088bb64e866240c969def60',1,'Mat_< unsigned char >::forEach(const Functor &operation) const']]], + ['foreach_5fimpl_428',['forEach_impl',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaa9eb8c7cba44b791827d0cd685206273',1,'cv::Mat::forEach_impl()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaa9eb8c7cba44b791827d0cd685206273',1,'forEach_impl(const Functor &operation)(Global Namespace)']]], + ['foreground_20extraction_20using_20grabcut_20algorithm_429',['Foreground Extraction using GrabCut Algorithm',['https://docs.opencv.org/4.2.0/dd/dfc/tutorial_js_grabcut.html',1,'Foreground Extraction using GrabCut Algorithm'],['https://docs.opencv.org/4.2.0/d8/d83/tutorial_py_grabcut.html',1,'Interactive Foreground Extraction using GrabCut Algorithm']]], + ['foreground_20segmentation_20methods_430',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], + ['forest_20training_431',['Structured forest training',['https://docs.opencv.org/4.2.0/d2/d59/tutorial_ximgproc_training.html',1,'']]], + ['forests_20for_20fast_20edge_20detection_432',['forests for fast edge detection',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html',1,'Structured forests for fast edge detection'],['https://docs.opencv.org/4.2.0/d0/da5/tutorial_ximgproc_prediction.html',1,'Structured forests for fast edge detection']]], + ['forget_5fdelay_433',['forget_delay',['https://docs.opencv.org/4.2.0/d7/d1d/structcv_1_1tbm_1_1TrackerParams.html#a28c5211e31078d18558d03ced44f8ba8',1,'cv::tbm::TrackerParams']]], + ['format_434',['Format',['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1838399ee67c0957c0ae42cabfa99033',1,'cv::ogl::Texture2D::Format'],['../cameraconfig.html#toplevel',1,'Top-Level Format']]], + ['format_435',['format',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#a73aaf40fda3872332aff523cf01eeb02',1,'cv::Formatter::format()'],['https://docs.opencv.org/4.2.0/d6/d55/classcv_1_1cudacodec_1_1RawVideoSource.html#a099a86ffcd64dd390c843162f3d97b31',1,'cv::cudacodec::RawVideoSource::format()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a99d34ec6c0656c850cb8ed2280453879',1,'cv::ogl::Texture2D::format()'],['https://docs.opencv.org/4.2.0/db/ded/classcv_1_1cudacodec_1_1VideoReader.html#a317027f37e8d45ca3aa41c19c8c862b6',1,'cv::cudacodec::VideoReader::format()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4a8d689c2bf7f9a32e1cdc9462cb9ca5',1,'match_results< _Bi_iter >::format(_Out_iter __out, const char_type *__fmt_first, const char_type *__fmt_last, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a75078225998ca82f96787929ba9d7646',1,'match_results< _Bi_iter >::format(_Out_iter __out, const basic_string< char_type, _St, _Sa > &__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6dd64effbedc4db4891802952f0b226e',1,'match_results< _Bi_iter >::format(const basic_string< char_type, _St, _Sa > &__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#acb9033dc604fc3ddd6a611de43e2857a',1,'match_results< _Bi_iter >::format(const char_type *__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4a8d689c2bf7f9a32e1cdc9462cb9ca5',1,'match_results< _Bi_iter >::format(_Out_iter __out, const char_type *__fmt_first, const char_type *__fmt_last, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a75078225998ca82f96787929ba9d7646',1,'match_results< _Bi_iter >::format(_Out_iter __out, const basic_string< char_type, _St, _Sa > &__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6dd64effbedc4db4891802952f0b226e',1,'match_results< _Bi_iter >::format(const basic_string< char_type, _St, _Sa > &__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#acb9033dc604fc3ddd6a611de43e2857a',1,'match_results< _Bi_iter >::format(const char_type *__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a4a8d689c2bf7f9a32e1cdc9462cb9ca5',1,'std::match_results::format(_Out_iter __out, const char_type *__fmt_first, const char_type *__fmt_last, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a75078225998ca82f96787929ba9d7646',1,'std::match_results::format(_Out_iter __out, const basic_string< char_type, _St, _Sa > &__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6dd64effbedc4db4891802952f0b226e',1,'std::match_results::format(const basic_string< char_type, _St, _Sa > &__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#acb9033dc604fc3ddd6a611de43e2857a',1,'std::match_results::format(const char_type *__fmt, match_flag_type __flags=regex_constants::format_default) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab231f1a6057f28d4244145e12c9fc0c7',1,'Eigen::DenseBase::format()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab231f1a6057f28d4244145e12c9fc0c7',1,'DenseBase< ArrayWrapper< ExpressionType > >::format()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab231f1a6057f28d4244145e12c9fc0c7',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::format()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab231f1a6057f28d4244145e12c9fc0c7',1,'DenseBase< Solve< Decomposition, RhsType > >::format()']]], + ['format_20hdf_20i_20o_436',['The Hierarchical Data Format (hdf) I/O',['https://docs.opencv.org/4.2.0/d3/d00/tutorial_table_of_content_hdf.html',1,'']]], + ['format_20i_20o_20routines_437',['Hierarchical Data Format I/O routines',['https://docs.opencv.org/4.2.0/db/d77/group__hdf.html',1,'']]], + ['format_20tt_438',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], + ['format_20version_205_439',['Hierarchical Data Format version 5',['https://docs.opencv.org/4.2.0/d6/dee/group__hdf5.html',1,'']]], + ['format_5fauto_440',['FORMAT_AUTO',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da5c1854b1f439d35644c7475791f3c47e',1,'cv::FileStorage']]], + ['format_5fdefault_441',['format_default',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ae8280c4746ec140dd2ad2106cbf787ad',1,'std::regex_constants']]], + ['format_5ffirst_5fonly_442',['format_first_only',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a0fc5b8b99c305b71cd713055afc983f9',1,'std::regex_constants']]], + ['format_5fjson_443',['FORMAT_JSON',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da65cebec1331fd20338511b2f5f31efe4',1,'cv::FileStorage']]], + ['format_5fmask_444',['FORMAT_MASK',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482dafa2bc69eece7e0210b59a0c7113d5b3e',1,'cv::FileStorage']]], + ['format_5fno_5fcopy_445',['format_no_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a65253b87e3f2138870e2d827ea5b4ea9',1,'std::regex_constants']]], + ['format_5fsed_446',['format_sed',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a3553e3ac3560a881732c367dcf567549',1,'std::regex_constants']]], + ['format_5fxml_447',['FORMAT_XML',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da753a7b441d2876fa8a77009472108356',1,'cv::FileStorage']]], + ['format_5fyaml_448',['FORMAT_YAML',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a973e41cb75ef6230412a567723b7482da63e7a7dcb2d68359210dc5fc8c83e92d',1,'cv::FileStorage']]], + ['formatinfo_449',['FormatInfo',['https://docs.opencv.org/4.2.0/d8/db6/structcv_1_1cudacodec_1_1FormatInfo.html',1,'cv::cudacodec']]], + ['formatmessage_450',['formatMessage',['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#afe6c2198ca3815de5385fd93f81f2c34',1,'cv::Exception']]], + ['formatted_451',['Formatted',['https://docs.opencv.org/4.2.0/d4/df3/classcv_1_1Formatted.html',1,'cv']]], + ['formatter_452',['Formatter',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html',1,'cv']]], + ['formatter_2eh_453',['formatter.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00755.html',1,'']]], + ['formatting_454',['Formatting',['../md_StyleGuide.html#autotoc_md2',1,'']]], + ['formatting_20with_20tt_20clang_20format_20tt_455',['Automatic formatting with <tt>clang-format</tt>',['../md_StyleGuide.html#autotoc_md4',1,'']]], + ['formattype_456',['FormatType',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1Formatter.html#abf8cb6362d243c3b42fa7787504bc08e',1,'cv::Formatter']]], + ['forward_457',['forward',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a39236126b72a365b94b132abd5bd946b',1,'cv::dnn::Layer::forward(std::vector< Mat * > &input, std::vector< Mat > &output, std::vector< Mat > &internals)'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#ab3c05d3e918cd96c39bc95aee0522353',1,'cv::dnn::Layer::forward(InputArrayOfArrays inputs, OutputArrayOfArrays outputs, OutputArrayOfArrays internals)'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a98ed94cb6ef7063d3697259566da310b',1,'cv::dnn::Net::forward(const String &outputName=String())'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a8d248f50efec70dffa785de18a4b2170',1,'cv::dnn::Net::forward(OutputArrayOfArrays outputBlobs, const String &outputName=String())'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#adb34d7650e555264c7da3b47d967311b',1,'cv::dnn::Net::forward(OutputArrayOfArrays outputBlobs, const std::vector< String > &outBlobNames)'],['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a00e707a86b2da4f980f9342b1fc2cc92',1,'cv::dnn::Net::forward(std::vector< std::vector< Mat > > &outputBlobs, const std::vector< String > &outBlobNames)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gacb5baec338e12b99cb6bddea7506c7c6',1,'std::forward(typename std::remove_reference< _Tp >::type &__t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gade8e8737b971a056c0ebba2de0295467',1,'std::forward(typename std::remove_reference< _Tp >::type &&__t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gacb5baec338e12b99cb6bddea7506c7c6',1,'forward(typename std::remove_reference< _Tp >::type &__t) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gade8e8737b971a056c0ebba2de0295467',1,'forward(typename std::remove_reference< _Tp >::type &&__t) noexcept(Global Namespace)']]], + ['forward_5fas_5ftuple_458',['forward_as_tuple',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gabb17aea09199e2c250d78b7657837144',1,'std::forward_as_tuple()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gabb17aea09199e2c250d78b7657837144',1,'forward_as_tuple()(Global Namespace)']]], + ['forward_5ffallback_459',['forward_fallback',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#ae240acf2b7ad43531ca903c927334c8a',1,'cv::dnn::Layer']]], + ['forward_5fiterator_5ftag_460',['forward_iterator_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07699.html',1,'std']]], + ['forward_5flist_461',['forward_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08843.html',1,'std::__debug::forward_list< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09111.html',1,'std::__profile::forward_list< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html',1,'std::forward_list< _Tp, _Alloc >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00065.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a2d179d6a061a4e6d8dcea244cdc29fe7',1,'std::forward_list::forward_list()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a4876e29ab044344ca726a36b6cdca01b',1,'std::forward_list::forward_list(const _Alloc &__al) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a43d0c48b0ef128ee0431be85c8fdd843',1,'std::forward_list::forward_list(const forward_list &__list, const _Alloc &__al)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a3a1601333d918ce64f330bf97c142e4c',1,'std::forward_list::forward_list(forward_list &&__list, const _Alloc &__al) noexcept(_Node_alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a950f84e93e993ce756a016954c4322db',1,'std::forward_list::forward_list(size_type __n, const _Alloc &__al=_Alloc())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a81dc09fa341ed4c54da852f6a430bba2',1,'std::forward_list::forward_list(size_type __n, const _Tp &__value, const _Alloc &__al=_Alloc())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac9a366e3ba3ca40c479e0f33e664e6e7',1,'std::forward_list::forward_list(_InputIterator __first, _InputIterator __last, const _Alloc &__al=_Alloc())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a642ecbf961b6a99a7deb77e676e71cac',1,'std::forward_list::forward_list(const forward_list &__list)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac57eaebb7af37579e166cb2c2b753f53',1,'std::forward_list::forward_list(forward_list &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a925933047508f0bd16df276c4f0261e4',1,'std::forward_list::forward_list(std::initializer_list< _Tp > __il, const _Alloc &__al=_Alloc())']]], + ['forward_5flist_2eh_462',['forward_list.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00338.html',1,'']]], + ['forward_5flist_2etcc_463',['forward_list.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00341.html',1,'']]], + ['forwardarmkinematics_464',['ForwardArmKinematics',['../classkinematics_1_1ForwardArmKinematics.html',1,'kinematics']]], + ['forwardarmkinematics_3c_202_2c_20n_20_3e_465',['ForwardArmKinematics< 2, N >',['../classkinematics_1_1ForwardArmKinematics.html',1,'kinematics']]], + ['forwardasync_466',['forwardAsync',['https://docs.opencv.org/4.2.0/db/d30/classcv_1_1dnn_1_1Net.html#a814890154ea9e10b132fec00b6f6ba30',1,'cv::dnn::Net']]], + ['forwardslice_467',['forwardSlice',['https://docs.opencv.org/4.2.0/dc/d75/classcv_1_1dnn_1_1ActivationLayer.html#aad4adf2e0dbc14a7618e395c0f898ac1',1,'cv::dnn::ActivationLayer']]], + ['fourcc_468',['fourcc',['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#afec93f94dc6c0b3e28f4dd153bc5a7f0',1,'cv::VideoWriter']]], + ['fourier_20descriptors_469',['Fourier descriptors',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html',1,'']]], + ['fourier_20transform_470',['Fourier Transform',['https://docs.opencv.org/4.2.0/d8/d01/tutorial_discrete_fourier_transform.html',1,'Discrete Fourier Transform'],['https://docs.opencv.org/4.2.0/de/dbc/tutorial_py_fourier_transform.html',1,'Fourier Transform'],['https://docs.opencv.org/4.2.0/dd/d02/tutorial_js_fourier_transform.html',1,'Fourier Transform']]], + ['fourier_5fdescriptors_2ehpp_471',['fourier_descriptors.hpp',['https://docs.opencv.org/4.2.0/db/d75/fourier__descriptors_8hpp.html',1,'']]], + ['fourierdescriptor_472',['fourierDescriptor',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#gac929d241e37cc33fdb59969d1b197dd2',1,'cv::ximgproc::fourierDescriptor()'],['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#gac929d241e37cc33fdb59969d1b197dd2',1,'fourierDescriptor()(Global Namespace)']]], + ['fp_5fcorrectly_5frounded_5fdivide_5fsqrt_473',['FP_CORRECTLY_ROUNDED_DIVIDE_SQRT',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4a071561c3c0c8008d94c62067088f5df7',1,'cv::ocl::Device']]], + ['fp_5fdenorm_474',['FP_DENORM',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4a60dc18c71389d33555c840d0bfc46f10',1,'cv::ocl::Device']]], + ['fp_5ffma_475',['FP_FMA',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4adeae6e772e7eb469f70c8ea6f4f0b6cf',1,'cv::ocl::Device']]], + ['fp_5finf_5fnan_476',['FP_INF_NAN',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4ad66d4ef5c3c99381ae528f7c50ee473a',1,'cv::ocl::Device']]], + ['fp_5fround_5fto_5finf_477',['FP_ROUND_TO_INF',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4a5333014b1113e6e6d3b98f66dc92680f',1,'cv::ocl::Device']]], + ['fp_5fround_5fto_5fnearest_478',['FP_ROUND_TO_NEAREST',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4a08c33555a63c5b7c57ba870582ef94e3',1,'cv::ocl::Device']]], + ['fp_5fround_5fto_5fzero_479',['FP_ROUND_TO_ZERO',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4acb9e624465310714bc00a1aad1e788d7',1,'cv::ocl::Device']]], + ['fp_5fsoft_5ffloat_480',['FP_SOFT_FLOAT',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a23e39afc829ef4f37bb22a004aabb5b4a7731143130a6c1455b6d8207c9bbd92b',1,'cv::ocl::Device']]], + ['fpos_481',['fpos',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html',1,'std::fpos< _StateT >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a6816aa318c7eeb099c78a3414a2bcdfd',1,'std::fpos::fpos()']]], + ['fps_482',['fps',['https://docs.opencv.org/4.2.0/d3/dad/structcv_1_1datasets_1_1GR__chalearnObj.html#a8567f2981a5a63a3214b4375f83e37ca',1,'cv::datasets::GR_chalearnObj::fps'],['https://docs.opencv.org/4.2.0/da/d0b/classcv_1_1videostab_1_1VideoFileSource.html#a61c733af4e06a8e80cbf7c3d39164719',1,'cv::videostab::VideoFileSource::fps()']]], + ['fr_5fadience_483',['FR_adience',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1datasets_1_1FR__adience.html',1,'cv::datasets']]], + ['fr_5fadience_2ehpp_484',['fr_adience.hpp',['https://docs.opencv.org/4.2.0/d5/d32/fr__adience_8hpp.html',1,'']]], + ['fr_5fadienceobj_485',['FR_adienceObj',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html',1,'cv::datasets']]], + ['fr_5flfw_486',['FR_lfw',['https://docs.opencv.org/4.2.0/dd/dda/classcv_1_1datasets_1_1FR__lfw.html',1,'cv::datasets']]], + ['fr_5flfw_2ehpp_487',['fr_lfw.hpp',['https://docs.opencv.org/4.2.0/d4/d13/fr__lfw_8hpp.html',1,'']]], + ['fr_5flfwobj_488',['FR_lfwObj',['https://docs.opencv.org/4.2.0/d9/d2d/structcv_1_1datasets_1_1FR__lfwObj.html',1,'cv::datasets']]], + ['frac_5fdigits_489',['frac_digits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ab087ab658475c890a25a4f2f564eb7ac',1,'std::moneypunct::frac_digits()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#ab087ab658475c890a25a4f2f564eb7ac',1,'std::moneypunct_byname::frac_digits()']]], + ['frame_5fidx_490',['frame_idx',['https://docs.opencv.org/4.2.0/d5/d1f/structcv_1_1tbm_1_1TrackedObject.html#aa5b2b1da715c62730a93bd620a30f569',1,'cv::tbm::TrackedObject']]], + ['frame_5fiterator_491',['frame_iterator',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a0986d6317590c33f1b45e669d02d112b',1,'cv']]], + ['frame_5flist_492',['frame_list',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a3fb9078b88bc768c9ac355e3aaebefb1',1,'cv']]], + ['frame_5fsource_2ehpp_493',['frame_source.hpp',['https://docs.opencv.org/4.2.0/df/da4/frame__source_8hpp.html',1,'']]], + ['framecount_494',['frameCount',['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a1effe095a8bc269e2b6b3520f7c47cfb',1,'cv::videostab::WobbleSuppressorBase']]], + ['framecount_5f_495',['frameCount_',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a97ba722224a9aebef85fc52f96ff40b5',1,'cv::videostab::TwoPassStabilizer::frameCount_'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a7116eafeb9dd8c996d26f939ce8eddbe',1,'cv::videostab::WobbleSuppressorBase::frameCount_']]], + ['framecounter_496',['frameCounter',['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a4900788197a062ea1a2b0f05595238cd',1,'cv::datasets::TRACK_alov::frameCounter'],['https://docs.opencv.org/4.2.0/dc/d52/classcv_1_1datasets_1_1TRACK__vot.html#afb4e847b90c29bf48205c385ecf2bbb9',1,'cv::datasets::TRACK_vot::frameCounter']]], + ['framemask_5f_497',['frameMask_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a6c0c928aba126ee1e82d99854c6802c4',1,'cv::videostab::StabilizerBase']]], + ['frames_498',['FRAMES',['https://docs.opencv.org/4.2.0/d0/da3/classcv_1_1viz_1_1WTrajectory.html#af448f4e56e68f9d7e1bd1a2c5fce691fab1fc57306f5e30904ab69133004ddcef',1,'cv::viz::WTrajectory']]], + ['frames_499',['frames',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a0b8c5dc2943fa470f8e2c5258887d152',1,'cv::videostab::DeblurerBase::frames()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a6333e5af269fefdff2cd0da105f6293d',1,'cv::videostab::InpainterBase::frames()']]], + ['frames_5f_500',['frames_',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a7829afbbb7562c05a76fb2902e199975',1,'cv::videostab::DeblurerBase::frames_'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#adc5085073fa501e61d8edfe5a34975c4',1,'cv::videostab::InpainterBase::frames_'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a1ea7895d1ad39d39fcea5e96a1bffa50',1,'cv::videostab::StabilizerBase::frames_']]], + ['framesize_501',['frameSize',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#aa7dc6835d7baeef8dc8d1c31f7e689d5',1,'cv::dynafu::Params::frameSize'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#aff95e7ffb345076e610feb73bd7e24e8',1,'cv::kinfu::Params::frameSize'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a3222a19973164afc9e804e3c01f181a5',1,'cv::videostab::LpMotionStabilizer::frameSize()']]], + ['framesize_5f_502',['frameSize_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#ac8532a295a5e7984095b44ceace4ea41',1,'cv::videostab::StabilizerBase']]], + ['framesource_503',['FrameSource',['https://docs.opencv.org/4.2.0/d4/dd6/classcv_1_1superres_1_1FrameSource.html',1,'cv::superres']]], + ['framesource_504',['frameSource',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a46172358a436b6e184626d8c67ba0d17',1,'cv::videostab::StabilizerBase']]], + ['framesource_5f_505',['frameSource_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a7ffe51bcff9eeb916f0b153e206bf604',1,'cv::videostab::StabilizerBase']]], + ['framework_506',['Framework',['https://docs.opencv.org/4.2.0/da/d9b/group__features2d.html',1,'2D Features Framework'],['https://docs.opencv.org/4.2.0/d1/db4/group__xfeatures2d.html',1,'Extra 2D Features Framework']]], + ['framework_507',['G-API framework',['https://docs.opencv.org/4.2.0/d7/d0d/group__gapi.html',1,'']]], + ['framework_20feature2d_20module_508',['2D Features framework (feature2d module)',['https://docs.opencv.org/4.2.0/d9/d97/tutorial_table_of_content_features2d.html',1,'']]], + ['framework_20for_20working_20with_20different_20datasets_509',['Framework for working with different datasets',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html',1,'']]], + ['framework_20models_510',['Load Caffe framework models',['https://docs.opencv.org/4.2.0/d5/de7/tutorial_dnn_googlenet.html',1,'']]], + ['freak_511',['FREAK',['https://docs.opencv.org/4.2.0/df/db4/classcv_1_1xfeatures2d_1_1FREAK.html',1,'cv::xfeatures2d']]], + ['free_512',['free',['https://docs.opencv.org/4.2.0/df/d98/classcv_1_1cuda_1_1GpuMat_1_1Allocator.html#afa6bd8ff6f7c002976bbb189950625fa',1,'cv::cuda::GpuMat::Allocator']]], + ['free_202d_20features_20algorithms_513',['Non-free 2D Features Algorithms',['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html',1,'']]], + ['free_20solvers_514',['Matrix-free solvers',['https://eigen.tuxfamily.org/dox/group__MatrixfreeSolverExample.html',1,'']]], + ['free_5fcoef_515',['free_coef',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a56f6acc89453e032e34ed32cef8ba8ce',1,'cv::HOGDescriptor']]], + ['free_5flist_516',['free_list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10287.html',1,'__gnu_cxx']]], + ['freeallreservedbuffers_517',['freeAllReservedBuffers',['https://docs.opencv.org/4.2.0/d4/dad/classcv_1_1BufferPoolController.html#a431aef2a415a02bf878a803247232151',1,'cv::BufferPoolController']]], + ['freelist_518',['freeList',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#ac3fd8d1d9f1c3d7d4124ec8677cbd128',1,'cv::SparseMat::Hdr']]], + ['freememory_519',['freeMemory',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#aa2f2efc92ad5f6bd1291a72293886dca',1,'cv::cuda::DeviceInfo']]], + ['freepoint_520',['freePoint',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a961a50c070ec1db71efcadb6a9a95cff',1,'cv::Subdiv2D']]], + ['freeqedge_521',['freeQEdge',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a6253d11fc0bcd400221d1735f8c1d283',1,'cv::Subdiv2D']]], + ['freetype_20harfbuzz_522',['Drawing UTF-8 strings with freetype/harfbuzz',['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html',1,'']]], + ['freetype_2ehpp_523',['freetype.hpp',['https://docs.opencv.org/4.2.0/dc/d8f/freetype_8hpp.html',1,'']]], + ['freetype2_524',['FreeType2',['https://docs.opencv.org/4.2.0/d9/dfa/classcv_1_1freetype_1_1FreeType2.html',1,'cv::freetype']]], + ['freetype_5ffont_525',['freetype_font',['https://docs.opencv.org/4.2.0/d6/d08/structcv_1_1gapi_1_1wip_1_1draw_1_1freetype__font.html',1,'cv::gapi::wip::draw']]], + ['freezestr_526',['freezeStr',['../namespaceutil.html#a44747fa29acced278a3a6cc7335a5698',1,'util']]], + ['frequently_20asked_20questions_527',['Frequently Asked Questions',['https://docs.opencv.org/4.2.0/d3/d2d/faq.html',1,'']]], + ['from_528',['from',['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html#ac4e43b1421e87ba73232f9d502925b49',1,'cv::detail::GraphEdge']]], + ['from_20an_20image_529',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], + ['from_20eigen_530',['from Eigen',['https://eigen.tuxfamily.org/dox/TopicUsingBlasLapack.html',1,'Using BLAS/LAPACK from Eigen'],['https://eigen.tuxfamily.org/dox/TopicUsingIntelMKL.html',1,'Using Intel® MKL from Eigen']]], + ['from_20matrix_531',['Inheriting from Matrix',['https://eigen.tuxfamily.org/dox/TopicCustomizing_InheritingMatrix.html',1,'']]], + ['from_20motion_532',['From Motion',['https://docs.opencv.org/4.2.0/d8/d8c/group__sfm.html',1,'Structure From Motion'],['https://docs.opencv.org/4.2.0/de/d7c/tutorial_table_of_content_sfm.html',1,'Structure From Motion']]], + ['from_20one_20color_20space_20to_20another_533',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], + ['from_20other_20doxygen_20projects_534',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], + ['from_20stereo_20images_535',['Depth Map from Stereo Images',['https://docs.opencv.org/4.2.0/dd/d53/tutorial_py_depthmap.html',1,'']]], + ['from_5fbson_536',['from_bson',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4e02793f2691aa29ab7cb69fddafbf5c.html#a4e02793f2691aa29ab7cb69fddafbf5c',1,'nlohmann::basic_json::from_bson(InputType &&i, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4118d0ec23d9eeafc236b9524d220e94.html#a4118d0ec23d9eeafc236b9524d220e94',1,'nlohmann::basic_json::from_bson(IteratorType first, IteratorType last, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ae2612581e4788ddffc2f45d5e4cc04fc.html#ae2612581e4788ddffc2f45d5e4cc04fc',1,'nlohmann::basic_json::from_bson(const T *ptr, std::size_t len, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a2afe89884edf72412a0624982324755d.html#a2afe89884edf72412a0624982324755d',1,'nlohmann::basic_json::from_bson(detail::span_input_adapter &&i, const bool strict=true, const bool allow_exceptions=true)']]], + ['from_5fbytes_537',['from_bytes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a5adef5a1030829016c2afe669a5d335f',1,'std::wstring_convert::from_bytes(char __byte)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#abd8e388d1f5e74cfaf824f8971bfb6dd',1,'std::wstring_convert::from_bytes(const char *__ptr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#af35796c796e1d9df713e0dd9fafea066',1,'std::wstring_convert::from_bytes(const byte_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#ab1176fe15be7975d9e57184c8d8d7e3e',1,'std::wstring_convert::from_bytes(const char *__first, const char *__last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#a5adef5a1030829016c2afe669a5d335f',1,'std::wstring_convert::from_bytes(char __byte)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#abd8e388d1f5e74cfaf824f8971bfb6dd',1,'std::wstring_convert::from_bytes(const char *__ptr)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#af35796c796e1d9df713e0dd9fafea066',1,'std::wstring_convert::from_bytes(const byte_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#ab1176fe15be7975d9e57184c8d8d7e3e',1,'std::wstring_convert::from_bytes(const char *__first, const char *__last)']]], + ['from_5fcbor_538',['from_cbor',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a44dd5635fb2da4710f6cd6e42b72773f.html#a44dd5635fb2da4710f6cd6e42b72773f',1,'nlohmann::basic_json::from_cbor(InputType &&i, const bool strict=true, const bool allow_exceptions=true, const cbor_tag_handler_t tag_handler=cbor_tag_handler_t::error)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aba4f6fc79cc405fb212ea3d992334e71.html#aba4f6fc79cc405fb212ea3d992334e71',1,'nlohmann::basic_json::from_cbor(IteratorType first, IteratorType last, const bool strict=true, const bool allow_exceptions=true, const cbor_tag_handler_t tag_handler=cbor_tag_handler_t::error)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a188755c8cda27e2afb03c016c14125d8.html#a188755c8cda27e2afb03c016c14125d8',1,'nlohmann::basic_json::from_cbor(const T *ptr, std::size_t len, const bool strict=true, const bool allow_exceptions=true, const cbor_tag_handler_t tag_handler=cbor_tag_handler_t::error)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4a67e47f4bcde55214475f47f8314c1f.html#a4a67e47f4bcde55214475f47f8314c1f',1,'nlohmann::basic_json::from_cbor(detail::span_input_adapter &&i, const bool strict=true, const bool allow_exceptions=true, const cbor_tag_handler_t tag_handler=cbor_tag_handler_t::error)']]], + ['from_5fjson_539',['from_json',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1adl__serializer_abdae6028cdef1bf1838b47eeb7022ebc.html#abdae6028cdef1bf1838b47eeb7022ebc',1,'nlohmann::adl_serializer::from_json(BasicJsonType &&j) noexcept(noexcept(::nlohmann::from_json(std::forward< BasicJsonType >(j), detail::identity_tag< TargetType > {}))) -> decltype(::nlohmann::from_json(std::forward< BasicJsonType >(j), detail::identity_tag< TargetType > {}))'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1adl__serializer_a8180f52bf21fc610705bc521f22116ae.html#a8180f52bf21fc610705bc521f22116ae',1,'nlohmann::adl_serializer::from_json(BasicJsonType &&j, TargetType &val) noexcept(noexcept(::nlohmann::from_json(std::forward< BasicJsonType >(j), val))) -> decltype(::nlohmann::from_json(std::forward< BasicJsonType >(j), val), void())'],['https://nlohmann.github.io/json/doxygen/namespacenlohmann_1_1anonymous__namespace_02json_8hpp_03_a69afe041fa2aeac2239b65ae88b64af8.html#a69afe041fa2aeac2239b65ae88b64af8',1,'nlohmann::anonymous_namespace{json.hpp}::from_json']]], + ['from_5fmsgpack_540',['from_msgpack',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_adbcab52fca1e25b3311ef14e71a57590.html#adbcab52fca1e25b3311ef14e71a57590',1,'nlohmann::basic_json::from_msgpack(InputType &&i, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a94dbeb08bcd13821512957dcbf3f00bd.html#a94dbeb08bcd13821512957dcbf3f00bd',1,'nlohmann::basic_json::from_msgpack(IteratorType first, IteratorType last, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0d69d3102639759d5202a6f764760d23.html#a0d69d3102639759d5202a6f764760d23',1,'nlohmann::basic_json::from_msgpack(const T *ptr, std::size_t len, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a84b3d89de8e774a2609dc4c0a1273f62.html#a84b3d89de8e774a2609dc4c0a1273f62',1,'nlohmann::basic_json::from_msgpack(detail::span_input_adapter &&i, const bool strict=true, const bool allow_exceptions=true)']]], + ['from_5fubjson_541',['from_ubjson',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa81f62db69978b90ff701f05c72e03a7.html#aa81f62db69978b90ff701f05c72e03a7',1,'nlohmann::basic_json::from_ubjson(InputType &&i, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9dbb422350fed520ce8c1ca8762c0251.html#a9dbb422350fed520ce8c1ca8762c0251',1,'nlohmann::basic_json::from_ubjson(IteratorType first, IteratorType last, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ab6eeda23c34cee79d8d72f1a8691a8de.html#ab6eeda23c34cee79d8d72f1a8691a8de',1,'nlohmann::basic_json::from_ubjson(const T *ptr, std::size_t len, const bool strict=true, const bool allow_exceptions=true)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a47201396899371881a46562bffb922da.html#a47201396899371881a46562bffb922da',1,'nlohmann::basic_json::from_ubjson(detail::span_input_adapter &&i, const bool strict=true, const bool allow_exceptions=true)']]], + ['frombinary_542',['fromBinary',['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a221c9df82bf2af3b61fd85925a0862ba',1,'cv::ocl::ProgramSource']]], + ['frombits_543',['fromBits',['https://docs.opencv.org/4.2.0/df/dc9/classcv_1_1float16__t.html#a634a5a8e4f62a8786f7218ee32edd30a',1,'cv::float16_t']]], + ['fromfilemotionreader_544',['FromFileMotionReader',['https://docs.opencv.org/4.2.0/d9/db3/classcv_1_1videostab_1_1FromFileMotionReader.html',1,'cv::videostab::FromFileMotionReader'],['https://docs.opencv.org/4.2.0/d9/db3/classcv_1_1videostab_1_1FromFileMotionReader.html#a1570812c6ce274afca6520d62ed2ac34',1,'cv::videostab::FromFileMotionReader::FromFileMotionReader()']]], + ['fromplyfile_545',['fromPlyFile',['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#a0bd62dc76ad1604c16752e4907f55fdb',1,'cv::viz::Widget']]], + ['frompositionorientationscale_546',['fromPositionOrientationScale',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#afac1e7bd782e5cc92cbf70128809d5d1',1,'Eigen::Transform']]], + ['fromraw_547',['fromRaw',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf69ed94a5e5dd2499598eeedcd655f68',1,'cv::softdouble::fromRaw()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaec5706db4303cd7c812996d810288440',1,'cv::softfloat::fromRaw()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaec5706db4303cd7c812996d810288440',1,'fromRaw(const uint32_t a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf69ed94a5e5dd2499598eeedcd655f68',1,'fromRaw(const uint64_t a)(Global Namespace)']]], + ['fromrotationmatrix_548',['fromRotationMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a2e35689645f69ba886df1a0a14b76ffe',1,'Eigen::AngleAxis::fromRotationMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a3e00ee4d983879c32d615b2a7153a26d',1,'Eigen::Rotation2D::fromRotationMatrix()']]], + ['fromspir_549',['fromSPIR',['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a264ddbcfeb541ceed587ea52291b3a0c',1,'cv::ocl::ProgramSource']]], + ['fromtwovectors_550',['FromTwoVectors',['https://eigen.tuxfamily.org/dox/classEigen_1_1Quaternion.html#acdb1eb44eb733b24749bc7892badde64',1,'Eigen::Quaternion']]], + ['front_551',['front',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ae5b6f85c316a0f9007f76047ad424a4b',1,'__gnu_cxx::__versa_string::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a2d530a251f3c1e3d9e1b6163bda94df8',1,'__gnu_cxx::__versa_string::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'__gnu_debug::basic_string::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'__gnu_debug::basic_string::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< _CharT >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< _CharT >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< _CharT, _Traits, _Allocator >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< _CharT, _Traits, _Allocator >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< char >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< char >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< char, char_traits< char >, _Byte_alloc >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< char, char_traits< char >, _Byte_alloc >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< char_type, _Traits, _Alloc >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< char_type, _Traits, _Alloc >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'basic_string< value_type >::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'basic_string< value_type >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ae5172d8f3ab8a44f5f68f5d6256e5c7e',1,'deque< _StateSeqT >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a62222a6cab13f17c0489a3d6242dd6a8',1,'deque< _StateSeqT >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad4367625f1676f2fc0d56b891db683fe',1,'list< __inp, __rebind_inp >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a5393c199d92f965d065b677f2230e51e',1,'list< __inp, __rebind_inp >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'match_results< _Bi_iter >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'match_results< _Bi_iter >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a4e7ef41fd4dbb69e831e2721fef8c1f5',1,'std::basic_string::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3dd02d2967a250d1e115f96907b05411',1,'std::basic_string::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#ae5172d8f3ab8a44f5f68f5d6256e5c7e',1,'std::deque::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a62222a6cab13f17c0489a3d6242dd6a8',1,'std::deque::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aa2daca181da8d9a22ecc19e4a7364b1f',1,'std::forward_list::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a40c8314a3fb6d46884588bcab67111b5',1,'std::forward_list::front() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad4367625f1676f2fc0d56b891db683fe',1,'std::list::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a5393c199d92f965d065b677f2230e51e',1,'std::list::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'std::match_results::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'std::match_results::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#a4a2ec140f75225a04b64572f4b914331',1,'std::queue::front()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#ac18027278a15d097de21b0bca5bcce40',1,'std::queue::front() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'std::vector::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'std::vector::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< __diff_type >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< __diff_type >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _CharClassT >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _CharClassT >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _CharT >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _CharT >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _Cmpt >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _Cmpt >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _Node *, _Nodeptr_Alloc >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _Node *, _Nodeptr_Alloc >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _RealType >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _RealType >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _State< _TraitsT::char_type > >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _State< _TraitsT::char_type > >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< _StringT >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< _StringT >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< block_type, allocator_type >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< block_type, allocator_type >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< Catalog_info * >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< Catalog_info * >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< double >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< double >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< int >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< int >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< result_type >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< result_type >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< size_t >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< size_t >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< std::pair< _BiIter, int > >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< std::pair< _BiIter, int > >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< std::pair< _StateIdT, std::vector > >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< std::pair< _StateIdT, std::vector > >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< std::pair< _StrTransT, _StrTransT > >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< std::pair< _StrTransT, _StrTransT > >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< sub_match< _Bi_iter >, _Alloc >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< sub_match< _Bi_iter >, _Alloc >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::front() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a460e9d810eb0009f44d8584662672a6b',1,'vector< sub_match< _BiIter >, _Alloc >::front() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a1a3f9b081e24c3932472aff316308554',1,'vector< sub_match< _BiIter >, _Alloc >::front() const noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5417ca43ae5e7a3a2f82eee2d915c6ed.html#a5417ca43ae5e7a3a2f82eee2d915c6ed',1,'nlohmann::basic_json::front()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5ac8f974c178cf9326b6765e22f50eb6.html#a5ac8f974c178cf9326b6765e22f50eb6',1,'nlohmann::basic_json::front() const']]], + ['front_5finsert_5fiterator_552',['front_insert_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html',1,'std::front_insert_iterator< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#af9af46e110258e56e4b6eb8a8b8d92c2',1,'std::front_insert_iterator::front_insert_iterator()']]], + ['front_5finserter_553',['front_inserter',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga3042ef36dac917905beccc35389af1cb',1,'std::front_inserter()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga3042ef36dac917905beccc35389af1cb',1,'front_inserter()(Global Namespace)']]], + ['fs_554',['fs',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a38cdd4298f4b76283b777c2b6b8369bb',1,'cv::FileNode::fs'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ad19a4d5591eaacf5608818f796cf02e4',1,'cv::FileNodeIterator::fs'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a8b175b4fad1f28da380f4487ee943db2',1,'cv::gapi::wip::draw::Text::fs']]], + ['fsr_5ffor_5finpainting_2emarkdown_555',['fsr_for_inpainting.markdown',['https://docs.opencv.org/4.2.0/d6/d01/fsr__for__inpainting_8markdown.html',1,'']]], + ['fstream_556',['fstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00068.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gabafb787f1b4ab7d00c500cefb554f632',1,'std::fstream'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01479.html#gabafb787f1b4ab7d00c500cefb554f632',1,'fstream(Global Namespace)']]], + ['fstream_2etcc_557',['fstream.tcc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00356.html',1,'']]], + ['ft02d_5fcomponents_558',['FT02D_components',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga2e6f8833aa72454850665baf7a583229',1,'cv::ft::FT02D_components()'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga2e6f8833aa72454850665baf7a583229',1,'FT02D_components()(Global Namespace)']]], + ['ft02d_5ffl_5fprocess_559',['FT02D_FL_process',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga55a31d93a56ff0713cb466b4c39f3b6f',1,'cv::ft::FT02D_FL_process()'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga55a31d93a56ff0713cb466b4c39f3b6f',1,'FT02D_FL_process()(Global Namespace)']]], + ['ft02d_5ffl_5fprocess_5ffloat_560',['FT02D_FL_process_float',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#gafc5685ee620a0b397c1b86c3fc82bd39',1,'cv::ft::FT02D_FL_process_float()'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#gafc5685ee620a0b397c1b86c3fc82bd39',1,'FT02D_FL_process_float()(Global Namespace)']]], + ['ft02d_5finverseft_561',['FT02D_inverseFT',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga03b14c805fcdfbb3f1b23e1ab4d1e12c',1,'cv::ft::FT02D_inverseFT()'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga03b14c805fcdfbb3f1b23e1ab4d1e12c',1,'FT02D_inverseFT()(Global Namespace)']]], + ['ft02d_5fiteration_562',['FT02D_iteration',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga03c0e714c646c6d0394ae0eb2c2ae2a3',1,'cv::ft::FT02D_iteration()'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#ga03c0e714c646c6d0394ae0eb2c2ae2a3',1,'FT02D_iteration()(Global Namespace)']]], + ['ft02d_5fprocess_563',['FT02D_process',['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#gab672419d3deead8602de611537099288',1,'cv::ft::FT02D_process()'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html#gab672419d3deead8602de611537099288',1,'FT02D_process()(Global Namespace)']]], + ['ft12d_5fcomponents_564',['FT12D_components',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga7d6d0321a9914d3796a1e3b9fc68a495',1,'cv::ft::FT12D_components()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga7d6d0321a9914d3796a1e3b9fc68a495',1,'FT12D_components()(Global Namespace)']]], + ['ft12d_5fcreatepolynommatrixhorizontal_565',['FT12D_createPolynomMatrixHorizontal',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga4cdc8614be18fd950b6da114168391b5',1,'cv::ft::FT12D_createPolynomMatrixHorizontal()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga4cdc8614be18fd950b6da114168391b5',1,'FT12D_createPolynomMatrixHorizontal()(Global Namespace)']]], + ['ft12d_5fcreatepolynommatrixvertical_566',['FT12D_createPolynomMatrixVertical',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#gae14b96c862f6c1b1f13cce03a95e3e2d',1,'cv::ft::FT12D_createPolynomMatrixVertical()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#gae14b96c862f6c1b1f13cce03a95e3e2d',1,'FT12D_createPolynomMatrixVertical()(Global Namespace)']]], + ['ft12d_5finverseft_567',['FT12D_inverseFT',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga42960e3dedc53cb7a2b210e21d0c71a2',1,'cv::ft::FT12D_inverseFT()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga42960e3dedc53cb7a2b210e21d0c71a2',1,'FT12D_inverseFT()(Global Namespace)']]], + ['ft12d_5fpolynomial_568',['FT12D_polynomial',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga3ac09befbc2b08c59cc9a60dbe3fdcca',1,'cv::ft::FT12D_polynomial()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga3ac09befbc2b08c59cc9a60dbe3fdcca',1,'FT12D_polynomial()(Global Namespace)']]], + ['ft12d_5fprocess_569',['FT12D_process',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga7a49b37ec6f442427b9a3ef4842189dd',1,'cv::ft::FT12D_process()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga7a49b37ec6f442427b9a3ef4842189dd',1,'FT12D_process()(Global Namespace)']]], + ['ftext_570',['FText',['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html',1,'cv::gapi::wip::draw::FText'],['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#aefc774a9d79c312a0057797220b247b2',1,'cv::gapi::wip::draw::FText::FText()']]], + ['ftp_571',['FTP',['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html#gga06e837be12dab197606d1155a8b94025a4652f36554cab9ec596798cdb98aa1c7',1,'cv::structured_light::FTP'],['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html#gga06e837be12dab197606d1155a8b94025a4652f36554cab9ec596798cdb98aa1c7',1,'FTP(Global Namespace)']]], + ['full_5faffine_5f_572',['full_affine_',['https://docs.opencv.org/4.2.0/d3/dda/classcv_1_1detail_1_1AffineBestOf2NearestMatcher.html#a3f40f14058ad648e529ec1c2952d9519',1,'cv::detail::AffineBestOf2NearestMatcher']]], + ['full_5fuv_573',['FULL_UV',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a4700f5207e66cdd9924bf64e34911832a312212af9fa27d5560981e24f845434a',1,'cv::SVD']]], + ['fullpivhouseholderqr_574',['FullPivHouseholderQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html',1,'Eigen::FullPivHouseholderQR< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aeb14b4c1eef33128207b40a00bd0bd08',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aeeace3abca6b215025e94c3e098b0a97',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#ac9bdb4f7fa77c1aa16f238592c248e70',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#abf722e1dc7241a5d6f76460ef0c87821',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR(Index rows, Index cols)']]], + ['fullpivhouseholderqr_575',['fullPivHouseholderQr',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a863bc0e06b641a089508eabec6835ab2',1,'Eigen::MatrixBase::fullPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a863bc0e06b641a089508eabec6835ab2',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::fullPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a863bc0e06b641a089508eabec6835ab2',1,'MatrixBase< Solve< Decomposition, RhsType > >::fullPivHouseholderQr()']]], + ['fullpivhouseholderqrpreconditioner_576',['FullPivHouseholderQRPreconditioner',['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56eabd745dcaff7019c5f918c68809e5ea50',1,'Eigen::FullPivHouseholderQRPreconditioner'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56eabd745dcaff7019c5f918c68809e5ea50',1,'FullPivHouseholderQRPreconditioner(Global Namespace)']]], + ['fullpivlu_577',['FullPivLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html',1,'Eigen::FullPivLU< class >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#af225528d1c6e623a2b1dce091907d13e',1,'Eigen::FullPivLU::FullPivLU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a31a6a984478a9f721f367667fe4c5ab1',1,'Eigen::FullPivLU::FullPivLU(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a3e903b9f401e3fc5d1ca7c6951c76185',1,'Eigen::FullPivLU::FullPivLU(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#ae83ebd2a24088f04e3ac835b0dc001e1',1,'Eigen::FullPivLU::FullPivLU(Index rows, Index cols)']]], + ['fullpivlu_578',['fullPivLu',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a25da97d31acab0ee5d9d13bdbb0569da',1,'Eigen::MatrixBase::fullPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a25da97d31acab0ee5d9d13bdbb0569da',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::fullPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a25da97d31acab0ee5d9d13bdbb0569da',1,'MatrixBase< Solve< Decomposition, RhsType > >::fullPivLu()']]], + ['func_579',['func',['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a5436ea62554761441ed4ce03938b49c1',1,'cv::Exception']]], + ['funcattrib_2ehpp_580',['funcattrib.hpp',['https://docs.opencv.org/4.2.0/db/dbc/funcattrib_8hpp.html',1,'']]], + ['functexcept_2eh_581',['functexcept.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00359.html',1,'']]], + ['function_582',['Function',['https://docs.opencv.org/4.2.0/da/d62/classcv_1_1MinProblemSolver_1_1Function.html',1,'cv::MinProblemSolver']]], + ['function_583',['function',['https://docs.opencv.org/4.2.0/d4/dd9/structcvv_1_1impl_1_1CallMetaData.html#ae56c8ab539e5a2e7ab0dc2b07eff5613',1,'cvv::impl::CallMetaData::function'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#aabc5bfd9d463ca6a06aa8198a1f12e14',1,'std::function< _Res(_ArgTypes...)>::function() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a4a3d52a1f71572613d699d0593479615',1,'std::function< _Res(_ArgTypes...)>::function(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a8869fed86e489fcedbf59cd814f440b3',1,'std::function< _Res(_ArgTypes...)>::function(const function &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a91f39c85ac536220f5efd7e505fc73e6',1,'std::function< _Res(_ArgTypes...)>::function(function &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a8c5a08fdc36581c53fa597667322cf7d',1,'std::function< _Res(_ArgTypes...)>::function(_Functor)']]], + ['function_20for_20mat_20data_584',['Plot function for Mat data',['https://docs.opencv.org/4.2.0/db/dfe/group__plot.html',1,'']]], + ['function_20objects_585',['Function Objects',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html',1,'']]], + ['function_20of_20keypoints_20and_20matches_586',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], + ['function_3c_20_5fres_28_5fargtypes_2e_2e_2e_29_3e_587',['function< _Res(_ArgTypes...)>',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html',1,'std']]], + ['functional_588',['functional',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00071.html',1,'']]], + ['functional_2ehpp_589',['functional.hpp',['https://docs.opencv.org/4.2.0/d7/dfd/modules_2core_2include_2opencv2_2core_2cuda_2functional_8hpp.html',1,'(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d4b/contrib_2modules_2cudev_2include_2opencv2_2cudev_2functional_2functional_8hpp.html',1,'(Global Namespace)']]], + ['functional_5fhash_2eh_590',['functional_hash.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00362.html',1,'']]], + ['functionality_591',['functionality',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html',1,'Core functionality'],['https://docs.opencv.org/4.2.0/df/d1f/group__gapi__core.html',1,'G-API Core functionality'],['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'G-API Drawing and composition functionality'],['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'G-API Image processing functionality']]], + ['functionality_20core_20module_592',['The Core Functionality (core module)',['https://docs.opencv.org/4.2.0/de/d7a/tutorial_table_of_content_core.html',1,'']]], + ['functions_593',['Functions',['https://docs.opencv.org/4.2.0/d5/d45/tutorial_py_contours_more_functions.html',1,'Contours : More Functions'],['https://docs.opencv.org/4.2.0/d8/d1c/tutorial_js_contours_more_functions.html',1,'Contours : More Functions'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html',1,'Drawing Functions'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html',1,'Functions'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html',1,'Functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html',1,'Mathematical Special Functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html',1,'Mathematical Special Functions'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html',1,'Qt New Functions']]], + ['functions_594',['functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html',1,'Adaptors for pointers to functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01523.html',1,'Array creation functions'],['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'Catalog of coefficient-wise math functions'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'Drawing operations and functions'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'Graph API: Image and channel composition functions'],['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'Passing Eigen objects by value to functions']]], + ['functions_20and_20macros_595',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], + ['functions_20for_20opencv_20samples_596',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]], + ['functions_20in_20opencv_597',['Drawing Functions in OpenCV',['https://docs.opencv.org/4.2.0/dc/da5/tutorial_py_drawing_functions.html',1,'']]], + ['functions_20taking_20eigen_20types_20as_20parameters_598',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], + ['functions_2eh_599',['functions.h',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00758.html',1,'']]], + ['functor_600',['functor',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseBinaryOp.html#adfb40100689f5e13be1786db5d7fecbf',1,'Eigen::CwiseBinaryOp::functor()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseNullaryOp.html#afef9c2479e357786e4c92da1aa625248',1,'Eigen::CwiseNullaryOp::functor()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseTernaryOp.html#a9009f896ee1103c8f28a748e59f12b9a',1,'Eigen::CwiseTernaryOp::functor()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseUnaryOp.html#aa70041dd94ec46f330cf19a06425d172',1,'Eigen::CwiseUnaryOp::functor()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseUnaryView.html#af01271cdadcbcf195b5d3130ff2e1a48',1,'Eigen::CwiseUnaryView::functor()']]], + ['fundamental_601',['Fundamental',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html',1,'']]], + ['fundamental_2ehpp_602',['fundamental.hpp',['https://docs.opencv.org/4.2.0/d4/db1/fundamental_8hpp.html',1,'']]], + ['fundamentalfromcorrespondences7pointrobust_603',['fundamentalFromCorrespondences7PointRobust',['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html#ga1d908603423af0d26be144fd233067c1',1,'cv::sfm::fundamentalFromCorrespondences7PointRobust()'],['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html#ga1d908603423af0d26be144fd233067c1',1,'fundamentalFromCorrespondences7PointRobust()(Global Namespace)']]], + ['fundamentalfromcorrespondences8pointrobust_604',['fundamentalFromCorrespondences8PointRobust',['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html#ga1c4d5becbdd48f48547837e44e9b3e98',1,'cv::sfm::fundamentalFromCorrespondences8PointRobust()'],['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html#ga1c4d5becbdd48f48547837e44e9b3e98',1,'fundamentalFromCorrespondences8PointRobust()(Global Namespace)']]], + ['fundamentalfromessential_605',['fundamentalFromEssential',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaaac7556ce8ebb74b199d416a3e86861a',1,'cv::sfm::fundamentalFromEssential()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaaac7556ce8ebb74b199d416a3e86861a',1,'fundamentalFromEssential()(Global Namespace)']]], + ['fundamentalfromprojections_606',['fundamentalFromProjections',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga02efdf4480a63d680a5dada595a88aa8',1,'cv::sfm::fundamentalFromProjections()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga02efdf4480a63d680a5dada595a88aa8',1,'fundamentalFromProjections()(Global Namespace)']]], + ['future_607',['future',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02239.html',1,'std::future< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a00074.html',1,'(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02239.html#a47c11429633480bddbb965a5f79ab410',1,'std::future::future()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02351.html#a290550ce931d18ccad7d296e4875ddb3',1,'std::future< _Res & >::future()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02355.html#a8d804ed9d3fb0818d7d4af8197cc00a7',1,'std::future< void >::future()']]], + ['future_3c_20_5fres_20_26_20_3e_608',['future< _Res & >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02351.html',1,'std']]], + ['future_3c_20void_20_3e_609',['future< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02355.html',1,'std']]], + ['future_5falready_5fretrieved_610',['future_already_retrieved',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a829037befd349f04ff71ddea385bdb9a',1,'future_already_retrieved(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a829037befd349f04ff71ddea385bdb9a',1,'future_already_retrieved(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6a829037befd349f04ff71ddea385bdb9a',1,'future_already_retrieved(Global Namespace)']]], + ['future_5fcategory_611',['future_category',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga5b4abfa468beb197d5bdac89e20afdb0',1,'std::future_category()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga5b4abfa468beb197d5bdac89e20afdb0',1,'future_category()(Global Namespace)']]], + ['future_5ferrc_612',['future_errc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6',1,'std::future_errc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga61938f7ac25df97b5362109e61bb46a6',1,'future_errc(Global Namespace)']]], + ['future_5ferror_613',['future_error',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02235.html',1,'std']]], + ['future_5fstatus_614',['future_status',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4',1,'std::future_status'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga528eb8f3b350394c0406d4d58ab7dbf4',1,'future_status(Global Namespace)']]], + ['futures_615',['Futures',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html',1,'']]], + ['fuzzy_20image_20processing_616',['Fuzzy image processing',['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html',1,'']]], + ['fuzzy_20image_20processing_20tutorials_617',['Fuzzy image processing tutorials',['https://docs.opencv.org/4.2.0/d7/d36/tutorial_fuzzy.html',1,'']]], + ['fuzzy_20mathematics_618',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], + ['fuzzy_2ehpp_619',['fuzzy.hpp',['https://docs.opencv.org/4.2.0/df/dc0/fuzzy_8hpp.html',1,'']]], + ['fuzzy_2emarkdown_620',['fuzzy.markdown',['https://docs.opencv.org/4.2.0/de/d62/fuzzy_8markdown.html',1,'']]], + ['fuzzy_5ff0_5fmath_2ehpp_621',['fuzzy_F0_math.hpp',['https://docs.opencv.org/4.2.0/d1/d6d/fuzzy__F0__math_8hpp.html',1,'']]], + ['fuzzy_5ff1_5fmath_2ehpp_622',['fuzzy_F1_math.hpp',['https://docs.opencv.org/4.2.0/d2/d46/fuzzy__F1__math_8hpp.html',1,'']]], + ['fuzzy_5fimage_2ehpp_623',['fuzzy_image.hpp',['https://docs.opencv.org/4.2.0/d3/dba/fuzzy__image_8hpp.html',1,'']]], + ['fx_624',['fx',['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#a2504642a05f313ad0798b0745e9f1842',1,'cv::cudev::ResizePtr']]], + ['fy_625',['fy',['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#aba1db2738b76bb71b114ec3375ffcb7f',1,'cv::cudev::ResizePtr']]] ]; diff --git a/search/classes_1.js b/search/classes_1.js index c616f14e..b1aa3b95 100644 --- a/search/classes_1.js +++ b/search/classes_1.js @@ -41,7 +41,7 @@ var searchData= ['adl_5fserializer_38',['adl_serializer',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1adl__serializer.html',1,'nlohmann']]], ['adopt_5flock_5ft_39',['adopt_lock_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07203.html',1,'std']]], ['affine3_40',['Affine3',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html',1,'cv']]], - ['affine3_3c_20float_20_3e_41',['Affine3< float >',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html',1,'']]], + ['affine3_3c_20float_20_3e_41',['Affine3< float >',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html',1,'Affine3< float >'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html',1,'cv::Affine3< float >']]], ['affinebasedestimator_42',['AffineBasedEstimator',['https://docs.opencv.org/4.2.0/d0/df2/classcv_1_1detail_1_1AffineBasedEstimator.html',1,'cv::detail']]], ['affinebestof2nearestmatcher_43',['AffineBestOf2NearestMatcher',['https://docs.opencv.org/4.2.0/d3/dda/classcv_1_1detail_1_1AffineBestOf2NearestMatcher.html',1,'cv::detail']]], ['affinefeature2d_44',['AffineFeature2D',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1xfeatures2d_1_1AffineFeature2D.html',1,'cv::xfeatures2d']]], @@ -176,9 +176,9 @@ var searchData= ['auto_5fptr_173',['auto_ptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html',1,'std']]], ['auto_5fptr_5fref_174',['auto_ptr_ref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08507.html',1,'std']]], ['autobuffer_175',['AutoBuffer',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'cv']]], - ['autobuffer_3c_20double_2c_201_20_3e_176',['AutoBuffer< double, 1 >',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'']]], - ['autobuffer_3c_20int64_2c_201_20_3e_177',['AutoBuffer< int64, 1 >',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'']]], - ['autobuffer_3c_20string_2c_201_20_3e_178',['AutoBuffer< String, 1 >',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'']]], + ['autobuffer_3c_20double_2c_201_20_3e_176',['AutoBuffer< double, 1 >',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'AutoBuffer< double, 1 >'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'cv::AutoBuffer< double, 1 >']]], + ['autobuffer_3c_20int64_2c_201_20_3e_177',['AutoBuffer< int64, 1 >',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'AutoBuffer< int64, 1 >'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'cv::AutoBuffer< int64, 1 >']]], + ['autobuffer_3c_20string_2c_201_20_3e_178',['AutoBuffer< String, 1 >',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'AutoBuffer< String, 1 >'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html',1,'cv::AutoBuffer< String, 1 >']]], ['autonomoustask_179',['AutonomousTask',['../classautonomous_1_1AutonomousTask.html',1,'autonomous']]], ['avcapturevideodataoutputsamplebufferdelegate_2dp_2dp_180',['AVCaptureVideoDataOutputSampleBufferDelegate-p-p',['https://docs.opencv.org/4.2.0/d7/dc6/classAVCaptureVideoDataOutputSampleBufferDelegate-p.html',1,'']]], ['averagehash_181',['AverageHash',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1img__hash_1_1AverageHash.html',1,'cv::img_hash']]], diff --git a/search/classes_10.js b/search/classes_10.js index a201cd6d..4dca7eb6 100644 --- a/search/classes_10.js +++ b/search/classes_10.js @@ -7,7 +7,7 @@ var searchData= ['pair_3c_20_5fbi_5fiter_2c_20_5fbi_5fiter_20_3e_4',['pair< _Bi_iter, _Bi_iter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], ['pair_3c_20_5fbiiter_2c_20_5fbiiter_20_3e_5',['pair< _BiIter, _BiIter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], ['pair_3c_20_5fiterator1_2c_20_5fiterator2_20_3e_6',['pair< _Iterator1, _Iterator2 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], - ['pair_3c_20_5fraiter_2c_20_5fraiter_20_3e_7',['pair< _RAIter, _RAIter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], + ['pair_3c_20_5fraiter_2c_20_5fraiter_20_3e_7',['pair< _RAIter, _RAIter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'pair< _RAIter, _RAIter >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'std::pair< _RAIter, _RAIter >']]], ['pair_3c_20char_2c_20_5ftokent_20_3e_8',['pair< char, _TokenT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], ['pair_3c_20char_2c_20char_20_3e_9',['pair< char, char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], ['pair_3c_20entry_5fpointer_2c_20typename_20_5falloc_3a_3asize_5ftype_20_3e_10',['pair< entry_pointer, typename _Alloc::size_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07803.html',1,'']]], @@ -128,8 +128,8 @@ var searchData= ['point3_5f_125',['Point3_',['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html',1,'cv']]], ['point_5f_126',['Point_',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'cv']]], ['point_5f_3c_20double_20_3e_127',['Point_< double >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'']]], - ['point_5f_3c_20float_20_3e_128',['Point_< float >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'']]], - ['point_5f_3c_20int_20_3e_129',['Point_< int >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'']]], + ['point_5f_3c_20float_20_3e_128',['Point_< float >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'cv::Point_< float >'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'Point_< float >']]], + ['point_5f_3c_20int_20_3e_129',['Point_< int >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'cv::Point_< int >'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html',1,'Point_< int >']]], ['point_5fconst_5fiterator_5f_130',['point_const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html',1,'']]], ['point_5finvalidation_5fguarantee_131',['point_invalidation_guarantee',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11199.html',1,'__gnu_pbds']]], ['point_5fiterator_5f_132',['point_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html',1,'']]], @@ -202,7 +202,7 @@ var searchData= ['ptrtraits_3c_20singlemaskchannelssz_3c_20maskptr_20_3e_20_3e_199',['PtrTraits< SingleMaskChannelsSz< MaskPtr > >',['https://docs.opencv.org/4.2.0/d4/d58/structcv_1_1cudev_1_1PtrTraits_3_01SingleMaskChannelsSz_3_01MaskPtr_01_4_01_4.html',1,'cv::cudev']]], ['ptrtraits_3c_20sobelxptrsz_3c_20srcptr_20_3e_20_3e_200',['PtrTraits< SobelXPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/dd/d73/structcv_1_1cudev_1_1PtrTraits_3_01SobelXPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], ['ptrtraits_3c_20sobelyptrsz_3c_20srcptr_20_3e_20_3e_201',['PtrTraits< SobelYPtrSz< SrcPtr > >',['https://docs.opencv.org/4.2.0/d4/d67/structcv_1_1cudev_1_1PtrTraits_3_01SobelYPtrSz_3_01SrcPtr_01_4_01_4.html',1,'cv::cudev']]], - ['ptrtraits_3c_20srcptr_20_3e_202',['PtrTraits< SrcPtr >',['https://docs.opencv.org/4.2.0/d2/d1a/structcv_1_1cudev_1_1PtrTraits.html',1,'']]], + ['ptrtraits_3c_20srcptr_20_3e_202',['PtrTraits< SrcPtr >',['https://docs.opencv.org/4.2.0/d2/d1a/structcv_1_1cudev_1_1PtrTraits.html',1,'cv::cudev::PtrTraits< SrcPtr >'],['https://docs.opencv.org/4.2.0/d2/d1a/structcv_1_1cudev_1_1PtrTraits.html',1,'PtrTraits< SrcPtr >']]], ['ptrtraits_3c_20texture_3c_20t_20_3e_20_3e_203',['PtrTraits< Texture< T > >',['https://docs.opencv.org/4.2.0/d2/db7/structcv_1_1cudev_1_1PtrTraits_3_01Texture_3_01T_01_4_01_4.html',1,'cv::cudev']]], ['ptrtraits_3c_20unarytransformptrsz_3c_20srcptr_2c_20op_20_3e_20_3e_204',['PtrTraits< UnaryTransformPtrSz< SrcPtr, Op > >',['https://docs.opencv.org/4.2.0/df/d71/structcv_1_1cudev_1_1PtrTraits_3_01UnaryTransformPtrSz_3_01SrcPtr_00_01Op_01_4_01_4.html',1,'cv::cudev']]], ['ptrtraits_3c_20zipptrsz_3c_20ptrtuple_20_3e_20_3e_205',['PtrTraits< ZipPtrSz< PtrTuple > >',['https://docs.opencv.org/4.2.0/db/d34/structcv_1_1cudev_1_1PtrTraits_3_01ZipPtrSz_3_01PtrTuple_01_4_01_4.html',1,'cv::cudev']]], diff --git a/search/classes_13.js b/search/classes_13.js index a0600e88..3ccb315c 100644 --- a/search/classes_13.js +++ b/search/classes_13.js @@ -24,7 +24,7 @@ var searchData= ['saturate_5fcast_5ffunc_21',['saturate_cast_func',['https://docs.opencv.org/4.2.0/dc/d99/structcv_1_1cudev_1_1saturate__cast__func.html',1,'cv::cudev']]], ['scalar_22',['Scalar',['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html',1,'cv::gapi::own']]], ['scalar_5f_23',['Scalar_',['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html',1,'cv']]], - ['scalar_5f_3c_20double_20_3e_24',['Scalar_< double >',['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html',1,'']]], + ['scalar_5f_3c_20double_20_3e_24',['Scalar_< double >',['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html',1,'cv::Scalar_< double >'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html',1,'Scalar_< double >']]], ['scalar_5fwrapper_25',['scalar_wrapper',['https://docs.opencv.org/4.2.0/d2/d64/structcv_1_1detail_1_1scalar__wrapper.html',1,'cv::detail']]], ['scalar_5fwrapper_5focl_26',['scalar_wrapper_ocl',['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1detail_1_1scalar__wrapper__ocl.html',1,'cv::detail']]], ['scalarbinaryoptraits_27',['ScalarBinaryOpTraits',['https://eigen.tuxfamily.org/dox/structEigen_1_1ScalarBinaryOpTraits.html',1,'Eigen']]], @@ -127,10 +127,10 @@ var searchData= ['shared_5fptr_3c_20ivideowriter_20_3e_124',['shared_ptr< IVideoWriter >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], ['shared_5fptr_3c_20priv_20_3e_125',['shared_ptr< Priv >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], ['shared_5fptr_3c_20separatedetectionwork_20_3e_126',['shared_ptr< SeparateDetectionWork >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20std_3a_3adeque_3c_20int_20_3e_20_3e_127',['shared_ptr< std::deque< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20std_3a_3amutex_20_3e_128',['shared_ptr< std::mutex >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'']]], - ['shared_5fptr_3c_20std_3a_3athread_20_3e_129',['shared_ptr< std::thread >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], - ['shared_5fptr_3c_20time_5fpoint_3c_20dataclock_20_3e_20_3e_130',['shared_ptr< time_point< dataclock > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20std_3a_3achrono_3a_3atime_5fpoint_3c_20dataclock_20_3e_20_3e_127',['shared_ptr< std::chrono::time_point< dataclock > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20std_3a_3adeque_3c_20int_20_3e_20_3e_128',['shared_ptr< std::deque< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], + ['shared_5fptr_3c_20std_3a_3amutex_20_3e_129',['shared_ptr< std::mutex >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'shared_ptr< std::mutex >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std::shared_ptr< std::mutex >']]], + ['shared_5fptr_3c_20std_3a_3athread_20_3e_130',['shared_ptr< std::thread >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], ['shared_5fptr_3c_20uint32_5ft_20_3e_131',['shared_ptr< uint32_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], ['shared_5fptr_3c_20videoinputstream_20_3e_132',['shared_ptr< VideoInputStream >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06899.html',1,'std']]], ['shared_5ftimed_5fmutex_133',['shared_timed_mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02779.html',1,'std']]], @@ -171,7 +171,7 @@ var searchData= ['sinusoidalpattern_168',['SinusoidalPattern',['https://docs.opencv.org/4.2.0/d6/d96/classcv_1_1structured__light_1_1SinusoidalPattern.html',1,'cv::structured_light']]], ['size_169',['Size',['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html',1,'cv::gapi::own']]], ['size_5f_170',['Size_',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html',1,'cv']]], - ['size_5f_3c_20float_20_3e_171',['Size_< float >',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html',1,'']]], + ['size_5f_3c_20float_20_3e_171',['Size_< float >',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html',1,'cv::Size_< float >'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html',1,'Size_< float >']]], ['skeleton_172',['skeleton',['https://docs.opencv.org/4.2.0/d4/d66/structcv_1_1datasets_1_1skeleton.html',1,'cv::datasets']]], ['sl2_173',['SL2',['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html',1,'cv']]], ['slam_5fkitti_174',['SLAM_kitti',['https://docs.opencv.org/4.2.0/d6/d92/classcv_1_1datasets_1_1SLAM__kitti.html',1,'cv::datasets']]], diff --git a/search/classes_14.js b/search/classes_14.js index 13d3dcfd..9646e05c 100644 --- a/search/classes_14.js +++ b/search/classes_14.js @@ -69,7 +69,7 @@ var searchData= ['tlsdata_66',['TLSData',['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html',1,'cv']]], ['tlsdata_3c_20cv_3a_3ainstr_3a_3anodedatatls_20_3e_67',['TLSData< cv::instr::NodeDataTls >',['https://docs.opencv.org/4.2.0/d9/db0/classcv_1_1TLSData.html',1,'']]], ['tlsdataaccumulator_68',['TLSDataAccumulator',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html',1,'cv']]], - ['tlsdataaccumulator_3c_20cv_3a_3ainstr_3a_3anodedatatls_20_3e_69',['TLSDataAccumulator< cv::instr::NodeDataTls >',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html',1,'']]], + ['tlsdataaccumulator_3c_20cv_3a_3ainstr_3a_3anodedatatls_20_3e_69',['TLSDataAccumulator< cv::instr::NodeDataTls >',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html',1,'cv::TLSDataAccumulator< cv::instr::NodeDataTls >'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html',1,'TLSDataAccumulator< cv::instr::NodeDataTls >']]], ['tlsdatacontainer_70',['TLSDataContainer',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html',1,'cv']]], ['tofilemotionwriter_71',['ToFileMotionWriter',['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html',1,'cv::videostab']]], ['tonemap_72',['Tonemap',['https://docs.opencv.org/4.2.0/d8/d5e/classcv_1_1Tonemap.html',1,'cv']]], diff --git a/search/classes_16.js b/search/classes_16.js index 5942dea1..9342e488 100644 --- a/search/classes_16.js +++ b/search/classes_16.js @@ -20,17 +20,17 @@ var searchData= ['vec_17',['Vec',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv']]], ['vec_3c_20_5ftp_2c_204_20_3e_18',['Vec< _Tp, 4 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], ['vec_3c_20double_2c_202_20_3e_19',['Vec< double, 2 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20double_2c_203_20_3e_20',['Vec< double, 3 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20double_2c_204_20_3e_21',['Vec< double, 4 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20double_2c_20gpcpatchdescriptor_3a_3anfeatures_20_3e_22',['Vec< double, GPCPatchDescriptor::nFeatures >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20double_2c_20nfeatures_20_3e_23',['Vec< double, nFeatures >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20float_2c_202_20_3e_24',['Vec< float, 2 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20float_2c_203_20_3e_25',['Vec< float, 3 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], - ['vec_3c_20int_2c_203_20_3e_26',['Vec< int, 3 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'']]], + ['vec_3c_20double_2c_203_20_3e_20',['Vec< double, 3 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< double, 3 >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< double, 3 >']]], + ['vec_3c_20double_2c_204_20_3e_21',['Vec< double, 4 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< double, 4 >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< double, 4 >']]], + ['vec_3c_20double_2c_20gpcpatchdescriptor_3a_3anfeatures_20_3e_22',['Vec< double, GPCPatchDescriptor::nFeatures >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< double, GPCPatchDescriptor::nFeatures >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< double, GPCPatchDescriptor::nFeatures >']]], + ['vec_3c_20double_2c_20nfeatures_20_3e_23',['Vec< double, nFeatures >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< double, nFeatures >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< double, nFeatures >']]], + ['vec_3c_20float_2c_202_20_3e_24',['Vec< float, 2 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< float, 2 >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< float, 2 >']]], + ['vec_3c_20float_2c_203_20_3e_25',['Vec< float, 3 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< float, 3 >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< float, 3 >']]], + ['vec_3c_20int_2c_203_20_3e_26',['Vec< int, 3 >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'cv::Vec< int, 3 >'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html',1,'Vec< int, 3 >']]], ['veccommainitializer_27',['VecCommaInitializer',['https://docs.opencv.org/4.2.0/d1/d3e/classcv_1_1VecCommaInitializer.html',1,'cv']]], ['vector_28',['vector',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08899.html',1,'std::__debug::vector< class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< _Tp, _Alloc >']]], ['vector_3c_20_5f_5fdiff_5ftype_20_3e_29',['vector< __diff_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20_5f_5fgnu_5fparallel_3a_3a_5fpiece_3c_20_5fdifferencetype_20_3e_20_3e_30',['vector< __gnu_parallel::_Piece< _DifferenceType > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20_5f_5fgnu_5fparallel_3a_3a_5fpiece_3c_20_5fdifferencetype_20_3e_20_3e_30',['vector< __gnu_parallel::_Piece< _DifferenceType > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< __gnu_parallel::_Piece< _DifferenceType > >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >']]], ['vector_3c_20_5fcharclasst_20_3e_31',['vector< _CharClassT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], ['vector_3c_20_5fchart_20_3e_32',['vector< _CharT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], ['vector_3c_20_5fcmpt_20_3e_33',['vector< _Cmpt >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], @@ -39,7 +39,7 @@ var searchData= ['vector_3c_20_5fstate_3c_20_5ftraitst_3a_3achar_5ftype_20_3e_20_3e_36',['vector< _State< _TraitsT::char_type > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], ['vector_3c_20_5fstringt_20_3e_37',['vector< _StringT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], ['vector_3c_20ar_3a_3amarkerpattern_20_3e_38',['vector< AR::MarkerPattern >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20block_5ftype_2c_20allocator_5ftype_20_3e_39',['vector< block_type, allocator_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20block_5ftype_2c_20allocator_5ftype_20_3e_39',['vector< block_type, allocator_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< block_type, allocator_type >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'vector< block_type, allocator_type >']]], ['vector_3c_20bool_2c_20_5falloc_20_3e_40',['vector< bool, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07303.html',1,'std']]], ['vector_3c_20catalog_5finfo_20_2a_20_3e_41',['vector< Catalog_info * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], ['vector_3c_20connhandler_5ft_20_3e_42',['vector< connhandler_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], @@ -72,41 +72,41 @@ var searchData= ['vector_3c_20cv_3a_3arect_5f_20_3e_69',['vector< cv::Rect_ >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], ['vector_3c_20cv_3a_3asize_5f_20_3e_70',['vector< cv::Size_ >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], ['vector_3c_20cv_3a_3aumat_20_3e_71',['vector< cv::UMat >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20double_20_3e_72',['vector< double >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20float_20_3e_73',['vector< float >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20garg_20_3e_74',['vector< GArg >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20gprotoarg_20_3e_75',['vector< GProtoArg >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20h264encoder_3a_3ax264_5fnal_5ft_5fsimple_20_3e_76',['vector< h264encoder::x264_nal_t_simple >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20int_20_3e_77',['vector< int >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20point_5f_3c_20float_20_3e_20_3e_78',['vector< Point_< float > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20point_5f_3c_20int_20_3e_20_3e_79',['vector< Point_< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20predictresult_20_3e_80',['vector< PredictResult >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20ptr_3c_20trackertargetstate_20_3e_20_3e_81',['vector< Ptr< TrackerTargetState > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20quadedge_20_3e_82',['vector< QuadEdge >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20result_5ftype_20_3e_83',['vector< result_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20scalar_5f_3c_20double_20_3e_20_3e_84',['vector< Scalar_< double > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20size_5ft_20_3e_85',['vector< size_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20std_3a_3apair_3c_20_5fbiiter_2c_20int_20_3e_20_3e_86',['vector< std::pair< _BiIter, int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20std_3a_3apair_3c_20_5fstateidt_2c_20std_3a_3avector_20_3e_20_3e_87',['vector< std::pair< _StateIdT, std::vector > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20std_3a_3apair_3c_20_5fstrtranst_2c_20_5fstrtranst_20_3e_20_3e_88',['vector< std::pair< _StrTransT, _StrTransT > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20std_3a_3apair_3c_20int_2c_20int_20_3e_20_3e_89',['vector< std::pair< int, int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3apair_3c_20ptr_3c_20trackertargetstate_20_3e_2c_20float_20_3e_20_3e_90',['vector< std::pair< Ptr< TrackerTargetState >, float > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3ashared_5fptr_20_3e_91',['vector< std::shared_ptr >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3ashared_5fptr_3c_20cv_3a_3alinemod_3a_3amodality_20_3e_20_3e_92',['vector< std::shared_ptr< cv::linemod::Modality > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3ashared_5fptr_3c_20cv_3a_3atracker_20_3e_20_3e_93',['vector< std::shared_ptr< cv::Tracker > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3astring_20_3e_94',['vector< std::string >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3avector_20_3e_95',['vector< std::vector >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3avector_3c_20cv_3a_3apoint3_5f_20_3e_20_3e_96',['vector< std::vector< cv::Point3_ > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3avector_3c_20cv_3a_3arange_20_3e_20_3e_97',['vector< std::vector< cv::Range > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3avector_3c_20int_20_3e_20_3e_98',['vector< std::vector< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3avector_3c_20point_5f_3c_20int_20_3e_20_3e_20_3e_99',['vector< std::vector< Point_< int > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20std_3a_3avector_3c_20std_3a_3ashared_5fptr_3c_20cv_3a_3adatasets_3a_3aobject_20_3e_20_3e_20_3e_100',['vector< std::vector< std::shared_ptr< cv::datasets::Object > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_2c_20_5falloc_20_3e_101',['vector< sub_match< _Bi_iter >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_2c_20allocator_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_20_3e_20_3e_102',['vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20sub_5fmatch_3c_20_5fbiiter_20_3e_2c_20_5falloc_20_3e_103',['vector< sub_match< _BiIter >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], - ['vector_3c_20uchar_20_3e_104',['vector< uchar >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20uint8_5ft_20_2a_20_3e_105',['vector< uint8_t * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], - ['vector_3c_20vec_3c_20int_2c_203_20_3e_20_3e_106',['vector< Vec< int, 3 > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20cv_3a_3avec_3c_20int_2c_203_20_3e_20_3e_72',['vector< cv::Vec< int, 3 > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20double_20_3e_73',['vector< double >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< double >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'vector< double >']]], + ['vector_3c_20float_20_3e_74',['vector< float >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20garg_20_3e_75',['vector< GArg >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20gprotoarg_20_3e_76',['vector< GProtoArg >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20h264encoder_3a_3ax264_5fnal_5ft_5fsimple_20_3e_77',['vector< h264encoder::x264_nal_t_simple >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20int_20_3e_78',['vector< int >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< int >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'vector< int >']]], + ['vector_3c_20point_5f_3c_20float_20_3e_20_3e_79',['vector< Point_< float > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20point_5f_3c_20int_20_3e_20_3e_80',['vector< Point_< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20predictresult_20_3e_81',['vector< PredictResult >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20ptr_3c_20trackertargetstate_20_3e_20_3e_82',['vector< Ptr< TrackerTargetState > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20quadedge_20_3e_83',['vector< QuadEdge >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20result_5ftype_20_3e_84',['vector< result_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20scalar_5f_3c_20double_20_3e_20_3e_85',['vector< Scalar_< double > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20size_5ft_20_3e_86',['vector< size_t >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std::vector< size_t >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'vector< size_t >']]], + ['vector_3c_20std_3a_3apair_3c_20_5fbiiter_2c_20int_20_3e_20_3e_87',['vector< std::pair< _BiIter, int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20std_3a_3apair_3c_20_5fstateidt_2c_20std_3a_3avector_20_3e_20_3e_88',['vector< std::pair< _StateIdT, std::vector > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20std_3a_3apair_3c_20_5fstrtranst_2c_20_5fstrtranst_20_3e_20_3e_89',['vector< std::pair< _StrTransT, _StrTransT > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20std_3a_3apair_3c_20int_2c_20int_20_3e_20_3e_90',['vector< std::pair< int, int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3apair_3c_20ptr_3c_20trackertargetstate_20_3e_2c_20float_20_3e_20_3e_91',['vector< std::pair< Ptr< TrackerTargetState >, float > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3ashared_5fptr_20_3e_92',['vector< std::shared_ptr >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3ashared_5fptr_3c_20cv_3a_3alinemod_3a_3amodality_20_3e_20_3e_93',['vector< std::shared_ptr< cv::linemod::Modality > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3ashared_5fptr_3c_20cv_3a_3atracker_20_3e_20_3e_94',['vector< std::shared_ptr< cv::Tracker > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3astring_20_3e_95',['vector< std::string >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3avector_20_3e_96',['vector< std::vector >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3avector_3c_20cv_3a_3apoint3_5f_20_3e_20_3e_97',['vector< std::vector< cv::Point3_ > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3avector_3c_20cv_3a_3arange_20_3e_20_3e_98',['vector< std::vector< cv::Range > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3avector_3c_20int_20_3e_20_3e_99',['vector< std::vector< int > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3avector_3c_20point_5f_3c_20int_20_3e_20_3e_20_3e_100',['vector< std::vector< Point_< int > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20std_3a_3avector_3c_20std_3a_3ashared_5fptr_3c_20cv_3a_3adatasets_3a_3aobject_20_3e_20_3e_20_3e_101',['vector< std::vector< std::shared_ptr< cv::datasets::Object > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_2c_20_5falloc_20_3e_102',['vector< sub_match< _Bi_iter >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_2c_20allocator_3c_20sub_5fmatch_3c_20_5fbi_5fiter_20_3e_20_3e_20_3e_103',['vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20sub_5fmatch_3c_20_5fbiiter_20_3e_2c_20_5falloc_20_3e_104',['vector< sub_match< _BiIter >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'']]], + ['vector_3c_20uchar_20_3e_105',['vector< uchar >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], + ['vector_3c_20uint8_5ft_20_2a_20_3e_106',['vector< uint8_t * >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], ['vector_3c_20vertex_20_3e_107',['vector< Vertex >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html',1,'std']]], ['vectorblock_108',['VectorBlock',['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorBlock.html',1,'Eigen']]], ['vectorref_109',['VectorRef',['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html',1,'cv::detail']]], @@ -160,8 +160,8 @@ var searchData= ['vectraits_3c_20ushort2_20_3e_157',['VecTraits< ushort2 >',['https://docs.opencv.org/4.2.0/d0/d40/structcv_1_1cudev_1_1VecTraits_3_01ushort2_01_4.html',1,'cv::cudev']]], ['vectraits_3c_20ushort3_20_3e_158',['VecTraits< ushort3 >',['https://docs.opencv.org/4.2.0/d4/dd7/structcv_1_1cudev_1_1VecTraits_3_01ushort3_01_4.html',1,'cv::cudev']]], ['vectraits_3c_20ushort4_20_3e_159',['VecTraits< ushort4 >',['https://docs.opencv.org/4.2.0/d3/d14/structcv_1_1cudev_1_1VecTraits_3_01ushort4_01_4.html',1,'cv::cudev']]], - ['vertex_160',['vertex',['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html',1,'cv::multicalib::MultiCameraCalibration']]], - ['vertex_161',['Vertex',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html',1,'cv::Subdiv2D']]], + ['vertex_160',['Vertex',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html',1,'cv::Subdiv2D']]], + ['vertex_161',['vertex',['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html',1,'cv::multicalib::MultiCameraCalibration']]], ['vgg_162',['VGG',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1xfeatures2d_1_1VGG.html',1,'cv::xfeatures2d']]], ['videocapture_163',['VideoCapture',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html',1,'cv']]], ['videofilesource_164',['VideoFileSource',['https://docs.opencv.org/4.2.0/da/d0b/classcv_1_1videostab_1_1VideoFileSource.html',1,'cv::videostab']]], diff --git a/search/classes_2.js b/search/classes_2.js index 25365303..0635ffc3 100644 --- a/search/classes_2.js +++ b/search/classes_2.js @@ -16,260 +16,262 @@ var searchData= ['bad_5falloc_13',['bad_alloc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01667.html',1,'std']]], ['bad_5fany_5fcast_14',['bad_any_cast',['https://docs.opencv.org/4.2.0/dc/d1b/classcv_1_1util_1_1bad__any__cast.html',1,'cv::util::bad_any_cast'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09959.html',1,'std::experimental::fundamentals_v1::bad_any_cast']]], ['bad_5fcast_15',['bad_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01683.html',1,'std']]], - ['bad_5fexception_16',['bad_exception',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01659.html',1,'std']]], - ['bad_5ffunction_5fcall_17',['bad_function_call',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07119.html',1,'std']]], - ['bad_5foptional_5faccess_18',['bad_optional_access',['https://docs.opencv.org/4.2.0/dd/dd6/classcv_1_1util_1_1bad__optional__access.html',1,'cv::util::bad_optional_access'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10083.html',1,'std::experimental::fundamentals_v1::bad_optional_access']]], - ['bad_5ftypeid_19',['bad_typeid',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01687.html',1,'std']]], - ['bad_5fvariant_5faccess_20',['bad_variant_access',['https://docs.opencv.org/4.2.0/d1/d54/classcv_1_1util_1_1bad__variant__access.html',1,'cv::util']]], - ['bad_5fweak_5fptr_21',['bad_weak_ptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06935.html',1,'std']]], - ['balanced_5fquicksort_5ftag_22',['balanced_quicksort_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09759.html',1,'__gnu_parallel']]], - ['balanced_5ftag_23',['balanced_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09715.html',1,'__gnu_parallel']]], - ['base_5fmotor_24',['base_motor',['../classrobot_1_1base__motor.html',1,'robot']]], - ['basecascadeclassifier_25',['BaseCascadeClassifier',['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html',1,'cv']]], - ['baseclassifier_26',['BaseClassifier',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html',1,'cv']]], - ['baseconvolutionlayer_27',['BaseConvolutionLayer',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html',1,'cv::dnn']]], - ['baseexpr_28',['BaseExpr',['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1BaseExpr.html',1,'Eigen::symbolic']]], - ['baseexpr_3c_20symbolexpr_3c_20tag_20_3e_20_3e_29',['BaseExpr< SymbolExpr< tag > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1BaseExpr.html',1,'']]], - ['baseocr_30',['BaseOCR',['https://docs.opencv.org/4.2.0/de/d3a/classcv_1_1text_1_1BaseOCR.html',1,'cv::text']]], - ['bases_31',['bases',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09815.html',1,'std::tr2']]], - ['basesfm_32',['BaseSFM',['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html',1,'cv::sfm']]], - ['basic_5fbranch_33',['basic_branch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11111.html',1,'__gnu_pbds']]], - ['basic_5fbranch_3c_20key_2c_20mapped_2c_20tag_2c_20detail_3a_3atree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20tag_2c_20_5falloc_20_3e_20_3a_3anode_5fupdate_2c_20_5f_5fgnu_5fcxx_3a_3atypelist_3a_3acreate2_3c_20cmp_5ffn_2c_20detail_3a_3atree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20tag_2c_20_5falloc_20_3e_20_3e_3a_3atype_2c_20_5falloc_20_3e_34',['basic_branch< Key, Mapped, Tag, detail::tree_traits< Key, Mapped, Cmp_Fn, Node_Update, Tag, _Alloc > ::node_update, __gnu_cxx::typelist::create2< Cmp_Fn, detail::tree_traits< Key, Mapped, Cmp_Fn, Node_Update, Tag, _Alloc > >::type, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11111.html',1,'']]], - ['basic_5fbranch_3c_20key_2c_20mapped_2c_20tag_2c_20detail_3a_3atrie_5ftraits_3c_20key_2c_20mapped_2c_20_5fatraits_2c_20node_5fupdate_2c_20tag_2c_20_5falloc_20_3e_20_3a_3anode_5fupdate_2c_20_5f_5fgnu_5fcxx_3a_3atypelist_3a_3acreate2_3c_20_5fatraits_2c_20detail_3a_3atrie_5ftraits_3c_20key_2c_20mapped_2c_20_5fatraits_2c_20node_5fupdate_2c_20tag_2c_20_5falloc_20_3e_20_3e_3a_3atype_2c_20_5falloc_20_3e_35',['basic_branch< Key, Mapped, Tag, detail::trie_traits< Key, Mapped, _ATraits, Node_Update, Tag, _Alloc > ::node_update, __gnu_cxx::typelist::create2< _ATraits, detail::trie_traits< Key, Mapped, _ATraits, Node_Update, Tag, _Alloc > >::type, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11111.html',1,'']]], - ['basic_5fbranch_5ftag_36',['basic_branch_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11235.html',1,'__gnu_pbds']]], - ['basic_5ffilebuf_37',['basic_filebuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html',1,'std']]], - ['basic_5ffilebuf_3c_20_5fchart_2c_20encoding_5fchar_5ftraits_3c_20_5fchart_20_3e_20_3e_38',['basic_filebuf< _CharT, encoding_char_traits< _CharT > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html',1,'']]], - ['basic_5ffilebuf_3c_20char_5ftype_2c_20traits_5ftype_20_3e_39',['basic_filebuf< char_type, traits_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html',1,'']]], - ['basic_5ffstream_40',['basic_fstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02079.html',1,'std']]], - ['basic_5fhash_5ftable_41',['basic_hash_table',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11099.html',1,'__gnu_pbds']]], - ['basic_5fhash_5ftable_3c_20key_2c_20mapped_2c_20hash_5ffn_2c_20eq_5ffn_2c_20resize_5fpolicy_2c_20store_5fhash_2c_20cc_5fhash_5ftag_2c_20_5f_5fgnu_5fcxx_3a_3atypelist_3a_3acreate1_3c_20comb_5fhash_5ffn_20_3e_3a_3atype_2c_20_5falloc_20_3e_42',['basic_hash_table< Key, Mapped, Hash_Fn, Eq_Fn, Resize_Policy, Store_Hash, cc_hash_tag, __gnu_cxx::typelist::create1< Comb_Hash_Fn >::type, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11099.html',1,'']]], - ['basic_5fhash_5ftable_3c_20key_2c_20mapped_2c_20hash_5ffn_2c_20eq_5ffn_2c_20resize_5fpolicy_2c_20store_5fhash_2c_20gp_5fhash_5ftag_2c_20_5f_5fgnu_5fcxx_3a_3atypelist_3a_3acreate2_3c_20comb_5fprobe_5ffn_2c_20probe_5ffn_20_3e_3a_3atype_2c_20_5falloc_20_3e_43',['basic_hash_table< Key, Mapped, Hash_Fn, Eq_Fn, Resize_Policy, Store_Hash, gp_hash_tag, __gnu_cxx::typelist::create2< Comb_Probe_Fn, Probe_Fn >::type, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11099.html',1,'']]], - ['basic_5fhash_5ftag_44',['basic_hash_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11223.html',1,'__gnu_pbds']]], - ['basic_5fifstream_45',['basic_ifstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02071.html',1,'std']]], - ['basic_5finvalidation_5fguarantee_46',['basic_invalidation_guarantee',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11195.html',1,'__gnu_pbds']]], - ['basic_5fios_47',['basic_ios',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html',1,'std']]], - ['basic_5fios_3c_20char_2c_20_5ftraits_20_3e_48',['basic_ios< char, _Traits >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html',1,'']]], - ['basic_5fiostream_49',['basic_iostream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02463.html',1,'std']]], - ['basic_5fiostream_3c_20char_20_3e_50',['basic_iostream< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02463.html',1,'']]], - ['basic_5fistream_51',['basic_istream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html',1,'std']]], - ['basic_5fistream_3c_20char_20_3e_52',['basic_istream< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html',1,'']]], - ['basic_5fistream_3c_20char_2c_20_5ftraits_20_3e_53',['basic_istream< char, _Traits >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html',1,'']]], - ['basic_5fistringstream_54',['basic_istringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02471.html',1,'std']]], - ['basic_5fjson_55',['basic_json',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json.html',1,'nlohmann']]], - ['basic_5fofstream_56',['basic_ofstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02075.html',1,'std']]], - ['basic_5fostream_57',['basic_ostream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html',1,'std']]], - ['basic_5fostream_3c_20char_20_3e_58',['basic_ostream< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html',1,'']]], - ['basic_5fostream_3c_20char_2c_20_5ftraits_20_3e_59',['basic_ostream< char, _Traits >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html',1,'']]], - ['basic_5fostringstream_60',['basic_ostringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02475.html',1,'std']]], - ['basic_5fregex_61',['basic_regex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html',1,'std']]], - ['basic_5fstreambuf_62',['basic_streambuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html',1,'std']]], - ['basic_5fstreambuf_3c_20_5felem_2c_20_5ftr_20_3e_63',['basic_streambuf< _Elem, _Tr >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html',1,'']]], - ['basic_5fstreambuf_3c_20char_2c_20_5ftraits_20_3e_64',['basic_streambuf< char, _Traits >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html',1,'']]], - ['basic_5fstreambuf_3c_20char_2c_20char_5ftraits_3c_20char_20_3e_20_3e_65',['basic_streambuf< char, char_traits< char > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html',1,'']]], - ['basic_5fstring_66',['basic_string',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08875.html',1,'__gnu_debug::basic_string< class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'std::basic_string< _CharT, _Traits, _Alloc >']]], - ['basic_5fstring_3c_20_5fchart_20_3e_67',['basic_string< _CharT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], - ['basic_5fstring_3c_20_5fchart_2c_20_5ftraits_2c_20_5fallocator_20_3e_68',['basic_string< _CharT, _Traits, _Allocator >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], - ['basic_5fstring_3c_20_5felem_2c_20char_5ftraits_3c_20_5felem_20_3e_2c_20_5fwide_5falloc_20_3e_69',['basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], - ['basic_5fstring_3c_20char_20_3e_70',['basic_string< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], - ['basic_5fstring_3c_20char_2c_20char_5ftraits_3c_20char_20_3e_2c_20_5fbyte_5falloc_20_3e_71',['basic_string< char, char_traits< char >, _Byte_alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], - ['basic_5fstring_3c_20char_5ftype_2c_20_5ftraits_2c_20_5falloc_20_3e_72',['basic_string< char_type, _Traits, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], - ['basic_5fstring_3c_20value_5ftype_20_3e_73',['basic_string< value_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], - ['basic_5fstring_5fview_74',['basic_string_view',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10175.html',1,'std::experimental::fundamentals_v1']]], - ['basic_5fstringbuf_75',['basic_stringbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html',1,'std']]], - ['basic_5fstringstream_76',['basic_stringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02479.html',1,'std']]], - ['basicfacerecognizer_77',['BasicFaceRecognizer',['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html',1,'cv::face']]], - ['basicvectorref_78',['BasicVectorRef',['https://docs.opencv.org/4.2.0/df/d63/classcv_1_1detail_1_1BasicVectorRef.html',1,'cv::detail']]], - ['batchnormlayer_79',['BatchNormLayer',['https://docs.opencv.org/4.2.0/d4/dd2/classcv_1_1dnn_1_1BatchNormLayer.html',1,'cv::dnn']]], - ['bbox_80',['BBox',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1face_1_1FacemarkLBF_1_1BBox.html',1,'cv::face::FacemarkLBF']]], - ['bdcsvd_81',['BDCSVD',['https://eigen.tuxfamily.org/dox/classEigen_1_1BDCSVD.html',1,'Eigen']]], - ['bernoulli_5fdistribution_82',['bernoulli_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html',1,'std']]], - ['bestof2nearestmatcher_83',['BestOf2NearestMatcher',['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html',1,'cv::detail']]], - ['bestof2nearestrangematcher_84',['BestOf2NearestRangeMatcher',['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1detail_1_1BestOf2NearestRangeMatcher.html',1,'cv::detail']]], - ['bfmatcher_85',['BFMatcher',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html',1,'cv']]], - ['bgr_5fto_5fbgra_5ffunc_86',['BGR_to_BGRA_func',['https://docs.opencv.org/4.2.0/d2/def/structcv_1_1cudev_1_1BGR__to__BGRA__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fgray_5ffunc_87',['BGR_to_GRAY_func',['https://docs.opencv.org/4.2.0/d1/d6e/structcv_1_1cudev_1_1BGR__to__GRAY__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fhls4_5ffull_5ffunc_88',['BGR_to_HLS4_FULL_func',['https://docs.opencv.org/4.2.0/d5/d9d/structcv_1_1cudev_1_1BGR__to__HLS4__FULL__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fhls4_5ffull_5ffunc_3c_20float_20_3e_89',['BGR_to_HLS4_FULL_func< float >',['https://docs.opencv.org/4.2.0/dd/d95/structcv_1_1cudev_1_1BGR__to__HLS4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgr_5fto_5fhls4_5ffunc_90',['BGR_to_HLS4_func',['https://docs.opencv.org/4.2.0/d1/d99/structcv_1_1cudev_1_1BGR__to__HLS4__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fhls4_5ffunc_3c_20float_20_3e_91',['BGR_to_HLS4_func< float >',['https://docs.opencv.org/4.2.0/d5/dfd/structcv_1_1cudev_1_1BGR__to__HLS4__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgr_5fto_5fhls_5ffull_5ffunc_92',['BGR_to_HLS_FULL_func',['https://docs.opencv.org/4.2.0/de/d50/structcv_1_1cudev_1_1BGR__to__HLS__FULL__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fhls_5ffull_5ffunc_3c_20float_20_3e_93',['BGR_to_HLS_FULL_func< float >',['https://docs.opencv.org/4.2.0/d7/db4/structcv_1_1cudev_1_1BGR__to__HLS__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgr_5fto_5fhls_5ffunc_94',['BGR_to_HLS_func',['https://docs.opencv.org/4.2.0/d7/d28/structcv_1_1cudev_1_1BGR__to__HLS__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fhls_5ffunc_3c_20float_20_3e_95',['BGR_to_HLS_func< float >',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1cudev_1_1BGR__to__HLS__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgr_5fto_5fhsv4_5ffull_5ffunc_96',['BGR_to_HSV4_FULL_func',['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1cudev_1_1BGR__to__HSV4__FULL__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fhsv4_5ffull_5ffunc_3c_20float_20_3e_97',['BGR_to_HSV4_FULL_func< float >',['https://docs.opencv.org/4.2.0/d1/d5e/structcv_1_1cudev_1_1BGR__to__HSV4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgr_5fto_5fhsv4_5ffunc_98',['BGR_to_HSV4_func',['https://docs.opencv.org/4.2.0/d9/db2/structcv_1_1cudev_1_1BGR__to__HSV4__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fhsv4_5ffunc_3c_20float_20_3e_99',['BGR_to_HSV4_func< float >',['https://docs.opencv.org/4.2.0/d7/dc2/structcv_1_1cudev_1_1BGR__to__HSV4__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgr_5fto_5fhsv_5ffull_5ffunc_100',['BGR_to_HSV_FULL_func',['https://docs.opencv.org/4.2.0/d5/d12/structcv_1_1cudev_1_1BGR__to__HSV__FULL__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fhsv_5ffull_5ffunc_3c_20float_20_3e_101',['BGR_to_HSV_FULL_func< float >',['https://docs.opencv.org/4.2.0/dd/d00/structcv_1_1cudev_1_1BGR__to__HSV__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgr_5fto_5fhsv_5ffunc_102',['BGR_to_HSV_func',['https://docs.opencv.org/4.2.0/dd/d23/structcv_1_1cudev_1_1BGR__to__HSV__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fhsv_5ffunc_3c_20float_20_3e_103',['BGR_to_HSV_func< float >',['https://docs.opencv.org/4.2.0/d6/df7/structcv_1_1cudev_1_1BGR__to__HSV__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgr_5fto_5flab4_5ffunc_104',['BGR_to_Lab4_func',['https://docs.opencv.org/4.2.0/d9/df2/structcv_1_1cudev_1_1BGR__to__Lab4__func.html',1,'cv::cudev']]], - ['bgr_5fto_5flab_5ffunc_105',['BGR_to_Lab_func',['https://docs.opencv.org/4.2.0/d5/d91/structcv_1_1cudev_1_1BGR__to__Lab__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fluv4_5ffunc_106',['BGR_to_Luv4_func',['https://docs.opencv.org/4.2.0/de/d8b/structcv_1_1cudev_1_1BGR__to__Luv4__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fluv_5ffunc_107',['BGR_to_Luv_func',['https://docs.opencv.org/4.2.0/da/d92/structcv_1_1cudev_1_1BGR__to__Luv__func.html',1,'cv::cudev']]], - ['bgr_5fto_5frgb_5ffunc_108',['BGR_to_RGB_func',['https://docs.opencv.org/4.2.0/df/dd8/structcv_1_1cudev_1_1BGR__to__RGB__func.html',1,'cv::cudev']]], - ['bgr_5fto_5frgba_5ffunc_109',['BGR_to_RGBA_func',['https://docs.opencv.org/4.2.0/d8/d77/structcv_1_1cudev_1_1BGR__to__RGBA__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fxyz4_5ffunc_110',['BGR_to_XYZ4_func',['https://docs.opencv.org/4.2.0/d7/d78/structcv_1_1cudev_1_1BGR__to__XYZ4__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fxyz_5ffunc_111',['BGR_to_XYZ_func',['https://docs.opencv.org/4.2.0/d1/d61/structcv_1_1cudev_1_1BGR__to__XYZ__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fycrcb4_5ffunc_112',['BGR_to_YCrCb4_func',['https://docs.opencv.org/4.2.0/d3/d27/structcv_1_1cudev_1_1BGR__to__YCrCb4__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fycrcb_5ffunc_113',['BGR_to_YCrCb_func',['https://docs.opencv.org/4.2.0/d5/d3a/structcv_1_1cudev_1_1BGR__to__YCrCb__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fyuv4_5ffunc_114',['BGR_to_YUV4_func',['https://docs.opencv.org/4.2.0/db/d18/structcv_1_1cudev_1_1BGR__to__YUV4__func.html',1,'cv::cudev']]], - ['bgr_5fto_5fyuv_5ffunc_115',['BGR_to_YUV_func',['https://docs.opencv.org/4.2.0/d7/d5d/structcv_1_1cudev_1_1BGR__to__YUV__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fbgr_5ffunc_116',['BGRA_to_BGR_func',['https://docs.opencv.org/4.2.0/d6/d66/structcv_1_1cudev_1_1BGRA__to__BGR__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fgray_5ffunc_117',['BGRA_to_GRAY_func',['https://docs.opencv.org/4.2.0/de/d7e/structcv_1_1cudev_1_1BGRA__to__GRAY__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fhls4_5ffull_5ffunc_118',['BGRA_to_HLS4_FULL_func',['https://docs.opencv.org/4.2.0/d8/d7c/structcv_1_1cudev_1_1BGRA__to__HLS4__FULL__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fhls4_5ffull_5ffunc_3c_20float_20_3e_119',['BGRA_to_HLS4_FULL_func< float >',['https://docs.opencv.org/4.2.0/dd/d9f/structcv_1_1cudev_1_1BGRA__to__HLS4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgra_5fto_5fhls4_5ffunc_120',['BGRA_to_HLS4_func',['https://docs.opencv.org/4.2.0/dc/da3/structcv_1_1cudev_1_1BGRA__to__HLS4__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fhls4_5ffunc_3c_20float_20_3e_121',['BGRA_to_HLS4_func< float >',['https://docs.opencv.org/4.2.0/d2/d33/structcv_1_1cudev_1_1BGRA__to__HLS4__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgra_5fto_5fhls_5ffull_5ffunc_122',['BGRA_to_HLS_FULL_func',['https://docs.opencv.org/4.2.0/d9/ddf/structcv_1_1cudev_1_1BGRA__to__HLS__FULL__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fhls_5ffull_5ffunc_3c_20float_20_3e_123',['BGRA_to_HLS_FULL_func< float >',['https://docs.opencv.org/4.2.0/d0/d64/structcv_1_1cudev_1_1BGRA__to__HLS__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgra_5fto_5fhls_5ffunc_124',['BGRA_to_HLS_func',['https://docs.opencv.org/4.2.0/de/d08/structcv_1_1cudev_1_1BGRA__to__HLS__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fhls_5ffunc_3c_20float_20_3e_125',['BGRA_to_HLS_func< float >',['https://docs.opencv.org/4.2.0/d8/d90/structcv_1_1cudev_1_1BGRA__to__HLS__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgra_5fto_5fhsv4_5ffull_5ffunc_126',['BGRA_to_HSV4_FULL_func',['https://docs.opencv.org/4.2.0/d6/da1/structcv_1_1cudev_1_1BGRA__to__HSV4__FULL__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fhsv4_5ffull_5ffunc_3c_20float_20_3e_127',['BGRA_to_HSV4_FULL_func< float >',['https://docs.opencv.org/4.2.0/d4/df0/structcv_1_1cudev_1_1BGRA__to__HSV4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgra_5fto_5fhsv4_5ffunc_128',['BGRA_to_HSV4_func',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1cudev_1_1BGRA__to__HSV4__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fhsv4_5ffunc_3c_20float_20_3e_129',['BGRA_to_HSV4_func< float >',['https://docs.opencv.org/4.2.0/d3/d25/structcv_1_1cudev_1_1BGRA__to__HSV4__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgra_5fto_5fhsv_5ffull_5ffunc_130',['BGRA_to_HSV_FULL_func',['https://docs.opencv.org/4.2.0/db/d15/structcv_1_1cudev_1_1BGRA__to__HSV__FULL__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fhsv_5ffull_5ffunc_3c_20float_20_3e_131',['BGRA_to_HSV_FULL_func< float >',['https://docs.opencv.org/4.2.0/d3/d43/structcv_1_1cudev_1_1BGRA__to__HSV__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgra_5fto_5fhsv_5ffunc_132',['BGRA_to_HSV_func',['https://docs.opencv.org/4.2.0/dc/d1f/structcv_1_1cudev_1_1BGRA__to__HSV__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fhsv_5ffunc_3c_20float_20_3e_133',['BGRA_to_HSV_func< float >',['https://docs.opencv.org/4.2.0/d9/d8a/structcv_1_1cudev_1_1BGRA__to__HSV__func_3_01float_01_4.html',1,'cv::cudev']]], - ['bgra_5fto_5flab4_5ffunc_134',['BGRA_to_Lab4_func',['https://docs.opencv.org/4.2.0/d0/de7/structcv_1_1cudev_1_1BGRA__to__Lab4__func.html',1,'cv::cudev']]], - ['bgra_5fto_5flab_5ffunc_135',['BGRA_to_Lab_func',['https://docs.opencv.org/4.2.0/d4/d7d/structcv_1_1cudev_1_1BGRA__to__Lab__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fluv4_5ffunc_136',['BGRA_to_Luv4_func',['https://docs.opencv.org/4.2.0/de/d52/structcv_1_1cudev_1_1BGRA__to__Luv4__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fluv_5ffunc_137',['BGRA_to_Luv_func',['https://docs.opencv.org/4.2.0/de/d8c/structcv_1_1cudev_1_1BGRA__to__Luv__func.html',1,'cv::cudev']]], - ['bgra_5fto_5frgb_5ffunc_138',['BGRA_to_RGB_func',['https://docs.opencv.org/4.2.0/d4/de2/structcv_1_1cudev_1_1BGRA__to__RGB__func.html',1,'cv::cudev']]], - ['bgra_5fto_5frgba_5ffunc_139',['BGRA_to_RGBA_func',['https://docs.opencv.org/4.2.0/d4/ddf/structcv_1_1cudev_1_1BGRA__to__RGBA__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fxyz4_5ffunc_140',['BGRA_to_XYZ4_func',['https://docs.opencv.org/4.2.0/d8/d57/structcv_1_1cudev_1_1BGRA__to__XYZ4__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fxyz_5ffunc_141',['BGRA_to_XYZ_func',['https://docs.opencv.org/4.2.0/de/d69/structcv_1_1cudev_1_1BGRA__to__XYZ__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fycrcb4_5ffunc_142',['BGRA_to_YCrCb4_func',['https://docs.opencv.org/4.2.0/d3/d09/structcv_1_1cudev_1_1BGRA__to__YCrCb4__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fycrcb_5ffunc_143',['BGRA_to_YCrCb_func',['https://docs.opencv.org/4.2.0/d6/dbd/structcv_1_1cudev_1_1BGRA__to__YCrCb__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fyuv4_5ffunc_144',['BGRA_to_YUV4_func',['https://docs.opencv.org/4.2.0/db/d43/structcv_1_1cudev_1_1BGRA__to__YUV4__func.html',1,'cv::cudev']]], - ['bgra_5fto_5fyuv_5ffunc_145',['BGRA_to_YUV_func',['https://docs.opencv.org/4.2.0/db/d7e/structcv_1_1cudev_1_1BGRA__to__YUV__func.html',1,'cv::cudev']]], - ['bicgstab_146',['BiCGSTAB',['https://eigen.tuxfamily.org/dox/classEigen_1_1BiCGSTAB.html',1,'Eigen']]], - ['bidirectional_5fiterator_5ftag_147',['bidirectional_iterator_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07703.html',1,'std']]], - ['bif_148',['BIF',['https://docs.opencv.org/4.2.0/dc/d12/classcv_1_1face_1_1BIF.html',1,'cv::face']]], - ['bin_5fsearch_5ftree_5fconst_5fit_5f_149',['bin_search_tree_const_it_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11635.html',1,'__gnu_pbds::detail']]], - ['bin_5fsearch_5ftree_5fconst_5fnode_5fit_5f_150',['bin_search_tree_const_node_it_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html',1,'__gnu_pbds::detail']]], - ['bin_5fsearch_5ftree_5fit_5f_151',['bin_search_tree_it_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11639.html',1,'__gnu_pbds::detail']]], - ['bin_5fsearch_5ftree_5fnode_5fit_5f_152',['bin_search_tree_node_it_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11631.html',1,'__gnu_pbds::detail']]], - ['bin_5fsearch_5ftree_5ftraits_153',['bin_search_tree_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html',1,'__gnu_pbds::detail']]], - ['bin_5fsearch_5ftree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20rb_5ftree_5fnode_5f_3c_20types_5ftraits_3c_20key_2c_20mapped_2c_20_5falloc_2c_20false_20_3e_3a_3avalue_5ftype_2c_20tree_5fnode_5fmetadata_5fdispatch_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20_5falloc_20_3e_3a_3atype_2c_20_5falloc_20_3e_2c_20_5falloc_20_3e_154',['bin_search_tree_traits< Key, Mapped, Cmp_Fn, Node_Update, rb_tree_node_< types_traits< Key, Mapped, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, Mapped, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html',1,'']]], - ['bin_5fsearch_5ftree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20splay_5ftree_5fnode_5f_3c_20types_5ftraits_3c_20key_2c_20mapped_2c_20_5falloc_2c_20false_20_3e_3a_3avalue_5ftype_2c_20tree_5fnode_5fmetadata_5fdispatch_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20_5falloc_20_3e_3a_3atype_2c_20_5falloc_20_3e_2c_20_5falloc_20_3e_155',['bin_search_tree_traits< Key, Mapped, Cmp_Fn, Node_Update, splay_tree_node_< types_traits< Key, Mapped, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, Mapped, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html',1,'']]], - ['bin_5fsearch_5ftree_5ftraits_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20node_2c_20_5falloc_20_3e_156',['bin_search_tree_traits< Key, null_type, Cmp_Fn, Node_Update, Node, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11647.html',1,'__gnu_pbds::detail']]], - ['bin_5fsearch_5ftree_5ftraits_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20rb_5ftree_5fnode_5f_3c_20types_5ftraits_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20false_20_3e_3a_3avalue_5ftype_2c_20tree_5fnode_5fmetadata_5fdispatch_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20_5falloc_20_3e_3a_3atype_2c_20_5falloc_20_3e_2c_20_5falloc_20_3e_157',['bin_search_tree_traits< Key, null_type, Cmp_Fn, Node_Update, rb_tree_node_< types_traits< Key, null_type, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, null_type, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html',1,'']]], - ['bin_5fsearch_5ftree_5ftraits_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20splay_5ftree_5fnode_5f_3c_20types_5ftraits_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20false_20_3e_3a_3avalue_5ftype_2c_20tree_5fnode_5fmetadata_5fdispatch_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20_5falloc_20_3e_3a_3atype_2c_20_5falloc_20_3e_2c_20_5falloc_20_3e_158',['bin_search_tree_traits< Key, null_type, Cmp_Fn, Node_Update, splay_tree_node_< types_traits< Key, null_type, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, null_type, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html',1,'']]], - ['binary_5fcompose_159',['binary_compose',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09163.html',1,'__gnu_cxx']]], - ['binary_5ffunction_160',['binary_function',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'cv::cudev::binary_function< _Arg1, _Arg2, _Result >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'std::binary_function< _Arg1, _Arg2, _Result >']]], - ['binary_5ffunction_3c_20_5f_5fshared_5fptr_3c_20_5ftp_2c_20_5flp_20_3e_2c_20_5f_5fshared_5fptr_3c_20_5ftp_2c_20_5flp_20_3e_2c_20bool_20_3e_161',['binary_function< __shared_ptr< _Tp, _Lp >, __shared_ptr< _Tp, _Lp >, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20_5f_5fweak_5fptr_3c_20_5ftp_2c_20_5flp_20_3e_2c_20_5f_5fweak_5fptr_3c_20_5ftp_2c_20_5flp_20_3e_2c_20bool_20_3e_162',['binary_function< __weak_ptr< _Tp, _Lp >, __weak_ptr< _Tp, _Lp >, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20_5farg1_2c_20_5farg2_2c_20_5farg1_20_3e_163',['binary_function< _Arg1, _Arg2, _Arg1 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20_5farg1_2c_20_5farg2_2c_20_5farg2_20_3e_164',['binary_function< _Arg1, _Arg2, _Arg2 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20_5fpredicate_3a_3afirst_5fargument_5ftype_2c_20_5fpredicate_3a_3asecond_5fargument_5ftype_2c_20bool_20_3e_165',['binary_function< _Predicate::first_argument_type, _Predicate::second_argument_type, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20_5ft1_2c_20_5ft2_2c_20_5fres_20_3e_166',['binary_function< _T1, _T2, _Res >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20_5ft1_2c_20_5ft2_2c_20bool_20_3e_167',['binary_function< _T1, _T2, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20_5ftp_20_2a_2c_20_5farg_2c_20_5fret_20_3e_168',['binary_function< _Tp *, _Arg, _Ret >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20_5ftp_20_2a_2c_20_5ftp_20_2a_2c_20bool_20_3e_169',['binary_function< _Tp *, _Tp *, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20_5ftp_2c_20_5farg_2c_20_5fret_20_3e_170',['binary_function< _Tp, _Arg, _Ret >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20_5ftp_2c_20_5ftp_2c_20_5ftp_20_3e_171',['binary_function< _Tp, _Tp, _Tp >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20_5ftp_2c_20_5ftp_2c_20bool_20_3e_172',['binary_function< _Tp, _Tp, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20_5ftp1_2c_20_5ftp2_2c_20_5fresult_20_3e_173',['binary_function< _Tp1, _Tp2, _Result >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20const_20_5ftp_20_2a_2c_20_5farg_2c_20_5fret_20_3e_174',['binary_function< const _Tp *, _Arg, _Ret >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20double_2c_20double_2c_20double_20_3e_175',['binary_function< double, double, double >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20float_2c_20float_2c_20float_20_3e_176',['binary_function< float, float, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20int_2c_20int_2c_20float_20_3e_177',['binary_function< int, int, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20int_2c_20int_2c_20int_20_3e_178',['binary_function< int, int, int >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20predicate_3a_3afirst_5fargument_5ftype_2c_20predicate_3a_3asecond_5fargument_5ftype_2c_20predicate_3a_3aresult_5ftype_20_3e_179',['binary_function< Predicate::first_argument_type, Predicate::second_argument_type, Predicate::result_type >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20rope_3c_20_5fchart_2c_20_5falloc_20_3e_2c_20rope_3c_20_5fchart_2c_20_5falloc_20_3e_2c_20rope_3c_20_5fchart_2c_20_5falloc_20_3e_20_3e_180',['binary_function< rope< _CharT, _Alloc >, rope< _CharT, _Alloc >, rope< _CharT, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20schar_2c_20schar_2c_20float_20_3e_181',['binary_function< schar, schar, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20schar_2c_20schar_2c_20schar_20_3e_182',['binary_function< schar, schar, schar >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20shared_5fptr_3c_20_5ftp_20_3e_2c_20shared_5fptr_3c_20_5ftp_20_3e_2c_20bool_20_3e_183',['binary_function< shared_ptr< _Tp >, shared_ptr< _Tp >, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20short_2c_20short_2c_20float_20_3e_184',['binary_function< short, short, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20short_2c_20short_2c_20short_20_3e_185',['binary_function< short, short, short >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20std_3a_3apair_3c_20_5ft1_2c_20_5ft2_20_3e_2c_20std_3a_3apair_3c_20_5ft1_2c_20_5ft2_20_3e_2c_20bool_20_3e_186',['binary_function< std::pair< _T1, _T2 >, std::pair< _T1, _T2 >, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20t_2c_20float_2c_20float_20_3e_187',['binary_function< T, float, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20t_2c_20t_2c_20functional_5fdetail_3a_3afloattype_3c_20t_20_3e_3a_3atype_20_3e_188',['binary_function< T, T, functional_detail::FloatType< T >::type >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20t_2c_20t_2c_20makevec_3c_20uchar_2c_20vectraits_3c_20t_20_3e_3a_3acn_20_3e_3a_3atype_20_3e_189',['binary_function< T, T, MakeVec< uchar, VecTraits< T >::cn >::type >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20t_2c_20t_2c_20t_20_3e_190',['binary_function< T, T, T >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20t1_2c_20t2_2c_20t1_20_3e_191',['binary_function< T1, T2, T1 >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20t1_2c_20t2_2c_20t2_20_3e_192',['binary_function< T1, T2, T2 >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20uchar_2c_20uchar_2c_20float_20_3e_193',['binary_function< uchar, uchar, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20uchar_2c_20uchar_2c_20uchar_20_3e_194',['binary_function< uchar, uchar, uchar >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20uint_2c_20uint_2c_20float_20_3e_195',['binary_function< uint, uint, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20uint_2c_20uint_2c_20uint_20_3e_196',['binary_function< uint, uint, uint >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20ushort_2c_20ushort_2c_20float_20_3e_197',['binary_function< ushort, ushort, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20ushort_2c_20ushort_2c_20ushort_20_3e_198',['binary_function< ushort, ushort, ushort >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], - ['binary_5ffunction_3c_20value_5ftype_2c_20value_5ftype_2c_20bool_20_3e_199',['binary_function< value_type, value_type, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20void_2c_20void_2c_20bool_20_3e_200',['binary_function< void, void, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5ffunction_3c_20weak_5fptr_3c_20_5ftp_20_3e_2c_20weak_5fptr_3c_20_5ftp_20_3e_2c_20bool_20_3e_201',['binary_function< weak_ptr< _Tp >, weak_ptr< _Tp >, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], - ['binary_5fheap_202',['binary_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11567.html',1,'__gnu_pbds::detail']]], - ['binary_5fheap_5fconst_5fiterator_5f_203',['binary_heap_const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html',1,'__gnu_pbds::detail']]], - ['binary_5fheap_5fpoint_5fconst_5fiterator_5f_204',['binary_heap_point_const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html',1,'__gnu_pbds::detail']]], - ['binary_5fheap_5ftag_205',['binary_heap_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11283.html',1,'__gnu_pbds']]], - ['binary_5fnegate_206',['binary_negate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07591.html',1,'std']]], - ['binarydescriptor_207',['BinaryDescriptor',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html',1,'cv::line_descriptor']]], - ['binarydescriptormatcher_208',['BinaryDescriptorMatcher',['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html',1,'cv::line_descriptor']]], - ['binarynegate_209',['BinaryNegate',['https://docs.opencv.org/4.2.0/d1/d81/structcv_1_1cudev_1_1BinaryNegate.html',1,'cv::cudev']]], - ['binarytransformptr_210',['BinaryTransformPtr',['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html',1,'cv::cudev']]], - ['binarytransformptrsz_211',['BinaryTransformPtrSz',['https://docs.opencv.org/4.2.0/d1/d0a/structcv_1_1cudev_1_1BinaryTransformPtrSz.html',1,'cv::cudev']]], - ['binarytupleadapter_212',['BinaryTupleAdapter',['https://docs.opencv.org/4.2.0/dc/da3/structcv_1_1cudev_1_1BinaryTupleAdapter.html',1,'cv::cudev']]], - ['binder1st_213',['Binder1st',['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1Binder1st.html',1,'cv::cudev']]], - ['binder1st_214',['binder1st',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08519.html',1,'std']]], - ['binder2nd_215',['Binder2nd',['https://docs.opencv.org/4.2.0/d6/db4/structcv_1_1cudev_1_1Binder2nd.html',1,'cv::cudev']]], - ['binder2nd_216',['binder2nd',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08523.html',1,'std']]], - ['binomial_5fdistribution_217',['binomial_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html',1,'std']]], - ['binomial_5fheap_218',['binomial_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11615.html',1,'__gnu_pbds::detail']]], - ['binomial_5fheap_5fbase_219',['binomial_heap_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11619.html',1,'__gnu_pbds::detail']]], - ['binomial_5fheap_5ftag_220',['binomial_heap_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11275.html',1,'__gnu_pbds']]], - ['bit_5fand_221',['bit_and',['https://docs.opencv.org/4.2.0/d9/de7/structcv_1_1cudev_1_1bit__and.html',1,'cv::cudev']]], - ['bit_5flshift_222',['bit_lshift',['https://docs.opencv.org/4.2.0/d3/d65/structcv_1_1cudev_1_1bit__lshift.html',1,'cv::cudev']]], - ['bit_5fnot_223',['bit_not',['https://docs.opencv.org/4.2.0/d0/d8a/structcv_1_1cudev_1_1bit__not.html',1,'cv::cudev']]], - ['bit_5for_224',['bit_or',['https://docs.opencv.org/4.2.0/dd/d1c/structcv_1_1cudev_1_1bit__or.html',1,'cv::cudev']]], - ['bit_5frshift_225',['bit_rshift',['https://docs.opencv.org/4.2.0/d4/d2a/structcv_1_1cudev_1_1bit__rshift.html',1,'cv::cudev']]], - ['bit_5fxor_226',['bit_xor',['https://docs.opencv.org/4.2.0/df/d44/structcv_1_1cudev_1_1bit__xor.html',1,'cv::cudev']]], - ['bitmap_5fallocator_227',['bitmap_allocator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10295.html',1,'__gnu_cxx']]], - ['bitset_228',['bitset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08831.html',1,'std::__debug::bitset< _Nb >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09099.html',1,'std::__profile::bitset< _Nb >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html',1,'std::bitset< _Nb >']]], - ['bitset_3c_20n_5flimit_5fswitch_20_3e_229',['bitset< N_LIMIT_SWITCH >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html',1,'std']]], - ['blanklayer_230',['BlankLayer',['https://docs.opencv.org/4.2.0/d8/d2d/classcv_1_1dnn_1_1BlankLayer.html',1,'cv::dnn']]], - ['blender_231',['Blender',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html',1,'cv::detail']]], - ['block_232',['Block',['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1Block.html',1,'cv::cudev::Block'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'Eigen::Block< class, BlockRows, BlockCols, InnerPanel >']]], - ['block_3c_20const_20eigen_3a_3amatrix_2c_20ambientdimatcompiletime_2c_201_20_3e_233',['Block< const Eigen::Matrix, AmbientDimAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'']]], - ['block_3c_20constmatrixtype_2c_20dim_2c_201_2c_21_28internal_3a_3atraits_3c_20eigen_3a_3amatrix_20_3e_3a_3aflags_20_26rowmajorbit_29_3e_234',['Block< ConstMatrixType, Dim, 1,!(internal::traits< Eigen::Matrix >::Flags &RowMajorBit)>',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'']]], - ['block_3c_20constmatrixtype_2c_20dim_2c_20dim_2c_20int_28mode_29_3d_3d_28affinecompact_29_20_26_26_28int_28options_29_26rowmajor_29_3d_3d0_20_3e_235',['Block< ConstMatrixType, Dim, Dim, int(Mode)==(AffineCompact) &&(int(Options)&RowMajor)==0 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'']]], - ['block_3c_20vectortype_2c_20internal_3a_3atraits_3c_20vectortype_20_3e_3a_3aflags_20_26rowmajorbit_20_3f_201_20_3asize_2c_20internal_3a_3atraits_3c_20vectortype_20_3e_3a_3aflags_20_26rowmajorbit_20_3f_20size_20_3a1_20_3e_236',['Block< VectorType, internal::traits< VectorType >::Flags &RowMajorBit ? 1 :Size, internal::traits< VectorType >::Flags &RowMajorBit ? Size :1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'']]], - ['blockimpl_3c_20xprtype_2c_20blockrows_2c_20blockcols_2c_20innerpanel_2c_20sparse_20_3e_237',['BlockImpl< XprType, BlockRows, BlockCols, InnerPanel, Sparse >',['https://eigen.tuxfamily.org/dox/classEigen_1_1BlockImpl_3_01XprType_00_01BlockRows_00_01BlockCols_00_01InnerPanel_00_01Sparse_01_4.html',1,'Eigen']]], - ['blockmeanhash_238',['BlockMeanHash',['https://docs.opencv.org/4.2.0/df/d55/classcv_1_1img__hash_1_1BlockMeanHash.html',1,'cv::img_hash']]], - ['blockschannelscompensator_239',['BlocksChannelsCompensator',['https://docs.opencv.org/4.2.0/d3/dab/classcv_1_1detail_1_1BlocksChannelsCompensator.html',1,'cv::detail']]], - ['blockscompensator_240',['BlocksCompensator',['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html',1,'cv::detail']]], - ['blocksgaincompensator_241',['BlocksGainCompensator',['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html',1,'cv::detail']]], - ['bnlllayer_242',['BNLLLayer',['https://docs.opencv.org/4.2.0/d0/d87/classcv_1_1dnn_1_1BNLLLayer.html',1,'cv::dnn']]], - ['board_243',['Board',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1aruco_1_1Board.html',1,'cv::aruco']]], - ['bool_5fset_244',['bool_set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html',1,'std::tr2']]], - ['boost_245',['Boost',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html',1,'cv::ml']]], - ['boostdesc_246',['BoostDesc',['https://docs.opencv.org/4.2.0/d1/dfd/classcv_1_1xfeatures2d_1_1BoostDesc.html',1,'cv::xfeatures2d']]], - ['border_247',['Border',['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html',1,'cv::gapi::fluid']]], - ['bowimgdescriptorextractor_248',['BOWImgDescriptorExtractor',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html',1,'cv']]], - ['bowkmeanstrainer_249',['BOWKMeansTrainer',['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html',1,'cv']]], - ['bowtrainer_250',['BOWTrainer',['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html',1,'cv']]], - ['box_251',['Box',['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1ximgproc_1_1Box.html',1,'cv::ximgproc']]], - ['branch_5fpolicy_252',['branch_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11651.html',1,'__gnu_pbds::detail']]], - ['branch_5fpolicy_3c_20node_5fcitr_2c_20node_5fcitr_2c_20_5falloc_20_3e_253',['branch_policy< Node_CItr, Node_CItr, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11655.html',1,'__gnu_pbds::detail']]], - ['brdbase_254',['BrdBase',['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html',1,'cv::cudev']]], - ['brdconstant_255',['BrdConstant',['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html',1,'cv::cudev']]], - ['brdreflect_256',['BrdReflect',['https://docs.opencv.org/4.2.0/dc/dff/structcv_1_1cudev_1_1BrdReflect.html',1,'cv::cudev']]], - ['brdreflect101_257',['BrdReflect101',['https://docs.opencv.org/4.2.0/d3/d12/structcv_1_1cudev_1_1BrdReflect101.html',1,'cv::cudev']]], - ['brdreplicate_258',['BrdReplicate',['https://docs.opencv.org/4.2.0/d7/de8/structcv_1_1cudev_1_1BrdReplicate.html',1,'cv::cudev']]], - ['brdwrap_259',['BrdWrap',['https://docs.opencv.org/4.2.0/da/d69/structcv_1_1cudev_1_1BrdWrap.html',1,'cv::cudev']]], - ['briefdescriptorextractor_260',['BriefDescriptorExtractor',['https://docs.opencv.org/4.2.0/d1/d93/classcv_1_1xfeatures2d_1_1BriefDescriptorExtractor.html',1,'cv::xfeatures2d']]], - ['brisk_261',['BRISK',['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html',1,'cv']]], - ['broxopticalflow_262',['BroxOpticalFlow',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html',1,'cv::cuda::BroxOpticalFlow'],['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html',1,'cv::superres::BroxOpticalFlow']]], - ['buffer_263',['Buffer',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html',1,'cv::gapi::fluid::Buffer'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html',1,'cv::ogl::Buffer']]], - ['bufferpool_264',['BufferPool',['https://docs.opencv.org/4.2.0/d5/d08/classcv_1_1cuda_1_1BufferPool.html',1,'cv::cuda']]], - ['bufferpoolcontroller_265',['BufferPoolController',['https://docs.opencv.org/4.2.0/d4/dad/classcv_1_1BufferPoolController.html',1,'cv']]], - ['bundleadjusteraffine_266',['BundleAdjusterAffine',['https://docs.opencv.org/4.2.0/d6/d8d/classcv_1_1detail_1_1BundleAdjusterAffine.html',1,'cv::detail']]], - ['bundleadjusteraffinepartial_267',['BundleAdjusterAffinePartial',['https://docs.opencv.org/4.2.0/d4/dbb/classcv_1_1detail_1_1BundleAdjusterAffinePartial.html',1,'cv::detail']]], - ['bundleadjusterbase_268',['BundleAdjusterBase',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html',1,'cv::detail']]], - ['bundleadjusterray_269',['BundleAdjusterRay',['https://docs.opencv.org/4.2.0/da/d7c/classcv_1_1detail_1_1BundleAdjusterRay.html',1,'cv::detail']]], - ['bundleadjusterreproj_270',['BundleAdjusterReproj',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1detail_1_1BundleAdjusterReproj.html',1,'cv::detail']]], - ['byte_5fcontainer_5fwith_5fsubtype_271',['byte_container_with_subtype',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype.html',1,'nlohmann']]] + ['bad_5fdatapoint_5faccess_16',['bad_datapoint_access',['../classrobot_1_1types_1_1bad__datapoint__access.html',1,'robot::types']]], + ['bad_5fexception_17',['bad_exception',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01659.html',1,'std']]], + ['bad_5ffunction_5fcall_18',['bad_function_call',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07119.html',1,'std']]], + ['bad_5foptional_5faccess_19',['bad_optional_access',['https://docs.opencv.org/4.2.0/dd/dd6/classcv_1_1util_1_1bad__optional__access.html',1,'cv::util::bad_optional_access'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10083.html',1,'std::experimental::fundamentals_v1::bad_optional_access']]], + ['bad_5ftypeid_20',['bad_typeid',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01687.html',1,'std']]], + ['bad_5fvariant_5faccess_21',['bad_variant_access',['https://docs.opencv.org/4.2.0/d1/d54/classcv_1_1util_1_1bad__variant__access.html',1,'cv::util']]], + ['bad_5fweak_5fptr_22',['bad_weak_ptr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06935.html',1,'std']]], + ['balanced_5fquicksort_5ftag_23',['balanced_quicksort_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09759.html',1,'__gnu_parallel']]], + ['balanced_5ftag_24',['balanced_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09715.html',1,'__gnu_parallel']]], + ['base_5fmotor_25',['base_motor',['../classrobot_1_1base__motor.html',1,'robot']]], + ['basecascadeclassifier_26',['BaseCascadeClassifier',['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html',1,'cv']]], + ['baseclassifier_27',['BaseClassifier',['https://docs.opencv.org/4.2.0/d7/d03/classcv_1_1BaseClassifier.html',1,'cv']]], + ['baseconvolutionlayer_28',['BaseConvolutionLayer',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html',1,'cv::dnn']]], + ['baseexpr_29',['BaseExpr',['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1BaseExpr.html',1,'Eigen::symbolic']]], + ['baseexpr_3c_20symbolexpr_3c_20tag_20_3e_20_3e_30',['BaseExpr< SymbolExpr< tag > >',['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1BaseExpr.html',1,'']]], + ['baseocr_31',['BaseOCR',['https://docs.opencv.org/4.2.0/de/d3a/classcv_1_1text_1_1BaseOCR.html',1,'cv::text']]], + ['bases_32',['bases',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09815.html',1,'std::tr2']]], + ['basesfm_33',['BaseSFM',['https://docs.opencv.org/4.2.0/d7/db1/classcv_1_1sfm_1_1BaseSFM.html',1,'cv::sfm']]], + ['basic_5fbranch_34',['basic_branch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11111.html',1,'__gnu_pbds']]], + ['basic_5fbranch_3c_20key_2c_20mapped_2c_20tag_2c_20detail_3a_3atree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20tag_2c_20_5falloc_20_3e_20_3a_3anode_5fupdate_2c_20_5f_5fgnu_5fcxx_3a_3atypelist_3a_3acreate2_3c_20cmp_5ffn_2c_20detail_3a_3atree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20tag_2c_20_5falloc_20_3e_20_3e_3a_3atype_2c_20_5falloc_20_3e_35',['basic_branch< Key, Mapped, Tag, detail::tree_traits< Key, Mapped, Cmp_Fn, Node_Update, Tag, _Alloc > ::node_update, __gnu_cxx::typelist::create2< Cmp_Fn, detail::tree_traits< Key, Mapped, Cmp_Fn, Node_Update, Tag, _Alloc > >::type, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11111.html',1,'']]], + ['basic_5fbranch_3c_20key_2c_20mapped_2c_20tag_2c_20detail_3a_3atrie_5ftraits_3c_20key_2c_20mapped_2c_20_5fatraits_2c_20node_5fupdate_2c_20tag_2c_20_5falloc_20_3e_20_3a_3anode_5fupdate_2c_20_5f_5fgnu_5fcxx_3a_3atypelist_3a_3acreate2_3c_20_5fatraits_2c_20detail_3a_3atrie_5ftraits_3c_20key_2c_20mapped_2c_20_5fatraits_2c_20node_5fupdate_2c_20tag_2c_20_5falloc_20_3e_20_3e_3a_3atype_2c_20_5falloc_20_3e_36',['basic_branch< Key, Mapped, Tag, detail::trie_traits< Key, Mapped, _ATraits, Node_Update, Tag, _Alloc > ::node_update, __gnu_cxx::typelist::create2< _ATraits, detail::trie_traits< Key, Mapped, _ATraits, Node_Update, Tag, _Alloc > >::type, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11111.html',1,'']]], + ['basic_5fbranch_5ftag_37',['basic_branch_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11235.html',1,'__gnu_pbds']]], + ['basic_5ffilebuf_38',['basic_filebuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html',1,'std']]], + ['basic_5ffilebuf_3c_20_5fchart_2c_20encoding_5fchar_5ftraits_3c_20_5fchart_20_3e_20_3e_39',['basic_filebuf< _CharT, encoding_char_traits< _CharT > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html',1,'']]], + ['basic_5ffilebuf_3c_20char_5ftype_2c_20traits_5ftype_20_3e_40',['basic_filebuf< char_type, traits_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html',1,'']]], + ['basic_5ffstream_41',['basic_fstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02079.html',1,'std']]], + ['basic_5fhash_5ftable_42',['basic_hash_table',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11099.html',1,'__gnu_pbds']]], + ['basic_5fhash_5ftable_3c_20key_2c_20mapped_2c_20hash_5ffn_2c_20eq_5ffn_2c_20resize_5fpolicy_2c_20store_5fhash_2c_20cc_5fhash_5ftag_2c_20_5f_5fgnu_5fcxx_3a_3atypelist_3a_3acreate1_3c_20comb_5fhash_5ffn_20_3e_3a_3atype_2c_20_5falloc_20_3e_43',['basic_hash_table< Key, Mapped, Hash_Fn, Eq_Fn, Resize_Policy, Store_Hash, cc_hash_tag, __gnu_cxx::typelist::create1< Comb_Hash_Fn >::type, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11099.html',1,'']]], + ['basic_5fhash_5ftable_3c_20key_2c_20mapped_2c_20hash_5ffn_2c_20eq_5ffn_2c_20resize_5fpolicy_2c_20store_5fhash_2c_20gp_5fhash_5ftag_2c_20_5f_5fgnu_5fcxx_3a_3atypelist_3a_3acreate2_3c_20comb_5fprobe_5ffn_2c_20probe_5ffn_20_3e_3a_3atype_2c_20_5falloc_20_3e_44',['basic_hash_table< Key, Mapped, Hash_Fn, Eq_Fn, Resize_Policy, Store_Hash, gp_hash_tag, __gnu_cxx::typelist::create2< Comb_Probe_Fn, Probe_Fn >::type, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11099.html',1,'']]], + ['basic_5fhash_5ftag_45',['basic_hash_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11223.html',1,'__gnu_pbds']]], + ['basic_5fifstream_46',['basic_ifstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02071.html',1,'std']]], + ['basic_5finvalidation_5fguarantee_47',['basic_invalidation_guarantee',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11195.html',1,'__gnu_pbds']]], + ['basic_5fios_48',['basic_ios',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html',1,'std']]], + ['basic_5fios_3c_20char_2c_20_5ftraits_20_3e_49',['basic_ios< char, _Traits >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html',1,'']]], + ['basic_5fiostream_50',['basic_iostream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02463.html',1,'std']]], + ['basic_5fiostream_3c_20char_20_3e_51',['basic_iostream< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02463.html',1,'']]], + ['basic_5fistream_52',['basic_istream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html',1,'std']]], + ['basic_5fistream_3c_20char_20_3e_53',['basic_istream< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html',1,'']]], + ['basic_5fistream_3c_20char_2c_20_5ftraits_20_3e_54',['basic_istream< char, _Traits >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html',1,'']]], + ['basic_5fistringstream_55',['basic_istringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02471.html',1,'std']]], + ['basic_5fjson_56',['basic_json',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json.html',1,'nlohmann']]], + ['basic_5fofstream_57',['basic_ofstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02075.html',1,'std']]], + ['basic_5fostream_58',['basic_ostream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html',1,'std']]], + ['basic_5fostream_3c_20char_20_3e_59',['basic_ostream< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html',1,'']]], + ['basic_5fostream_3c_20char_2c_20_5ftraits_20_3e_60',['basic_ostream< char, _Traits >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html',1,'']]], + ['basic_5fostringstream_61',['basic_ostringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02475.html',1,'std']]], + ['basic_5fregex_62',['basic_regex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html',1,'std']]], + ['basic_5fstreambuf_63',['basic_streambuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html',1,'std']]], + ['basic_5fstreambuf_3c_20_5felem_2c_20_5ftr_20_3e_64',['basic_streambuf< _Elem, _Tr >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html',1,'']]], + ['basic_5fstreambuf_3c_20char_2c_20_5ftraits_20_3e_65',['basic_streambuf< char, _Traits >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html',1,'']]], + ['basic_5fstreambuf_3c_20char_2c_20char_5ftraits_3c_20char_20_3e_20_3e_66',['basic_streambuf< char, char_traits< char > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html',1,'']]], + ['basic_5fstring_67',['basic_string',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08875.html',1,'__gnu_debug::basic_string< class, class, class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'std::basic_string< _CharT, _Traits, _Alloc >']]], + ['basic_5fstring_3c_20_5fchart_20_3e_68',['basic_string< _CharT >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], + ['basic_5fstring_3c_20_5fchart_2c_20_5ftraits_2c_20_5fallocator_20_3e_69',['basic_string< _CharT, _Traits, _Allocator >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], + ['basic_5fstring_3c_20_5felem_2c_20char_5ftraits_3c_20_5felem_20_3e_2c_20_5fwide_5falloc_20_3e_70',['basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], + ['basic_5fstring_3c_20char_20_3e_71',['basic_string< char >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], + ['basic_5fstring_3c_20char_2c_20char_5ftraits_3c_20char_20_3e_2c_20_5fbyte_5falloc_20_3e_72',['basic_string< char, char_traits< char >, _Byte_alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], + ['basic_5fstring_3c_20char_5ftype_2c_20_5ftraits_2c_20_5falloc_20_3e_73',['basic_string< char_type, _Traits, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], + ['basic_5fstring_3c_20value_5ftype_20_3e_74',['basic_string< value_type >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html',1,'']]], + ['basic_5fstring_5fview_75',['basic_string_view',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10175.html',1,'std::experimental::fundamentals_v1']]], + ['basic_5fstringbuf_76',['basic_stringbuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html',1,'std']]], + ['basic_5fstringstream_77',['basic_stringstream',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02479.html',1,'std']]], + ['basicfacerecognizer_78',['BasicFaceRecognizer',['https://docs.opencv.org/4.2.0/dc/dd7/classcv_1_1face_1_1BasicFaceRecognizer.html',1,'cv::face']]], + ['basicvectorref_79',['BasicVectorRef',['https://docs.opencv.org/4.2.0/df/d63/classcv_1_1detail_1_1BasicVectorRef.html',1,'cv::detail']]], + ['batchnormlayer_80',['BatchNormLayer',['https://docs.opencv.org/4.2.0/d4/dd2/classcv_1_1dnn_1_1BatchNormLayer.html',1,'cv::dnn']]], + ['bbox_81',['BBox',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1face_1_1FacemarkLBF_1_1BBox.html',1,'cv::face::FacemarkLBF']]], + ['bdcsvd_82',['BDCSVD',['https://eigen.tuxfamily.org/dox/classEigen_1_1BDCSVD.html',1,'Eigen']]], + ['bernoulli_5fdistribution_83',['bernoulli_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html',1,'std']]], + ['bestof2nearestmatcher_84',['BestOf2NearestMatcher',['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html',1,'cv::detail']]], + ['bestof2nearestrangematcher_85',['BestOf2NearestRangeMatcher',['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1detail_1_1BestOf2NearestRangeMatcher.html',1,'cv::detail']]], + ['bfmatcher_86',['BFMatcher',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html',1,'cv']]], + ['bgr_5fto_5fbgra_5ffunc_87',['BGR_to_BGRA_func',['https://docs.opencv.org/4.2.0/d2/def/structcv_1_1cudev_1_1BGR__to__BGRA__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fgray_5ffunc_88',['BGR_to_GRAY_func',['https://docs.opencv.org/4.2.0/d1/d6e/structcv_1_1cudev_1_1BGR__to__GRAY__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fhls4_5ffull_5ffunc_89',['BGR_to_HLS4_FULL_func',['https://docs.opencv.org/4.2.0/d5/d9d/structcv_1_1cudev_1_1BGR__to__HLS4__FULL__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fhls4_5ffull_5ffunc_3c_20float_20_3e_90',['BGR_to_HLS4_FULL_func< float >',['https://docs.opencv.org/4.2.0/dd/d95/structcv_1_1cudev_1_1BGR__to__HLS4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgr_5fto_5fhls4_5ffunc_91',['BGR_to_HLS4_func',['https://docs.opencv.org/4.2.0/d1/d99/structcv_1_1cudev_1_1BGR__to__HLS4__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fhls4_5ffunc_3c_20float_20_3e_92',['BGR_to_HLS4_func< float >',['https://docs.opencv.org/4.2.0/d5/dfd/structcv_1_1cudev_1_1BGR__to__HLS4__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgr_5fto_5fhls_5ffull_5ffunc_93',['BGR_to_HLS_FULL_func',['https://docs.opencv.org/4.2.0/de/d50/structcv_1_1cudev_1_1BGR__to__HLS__FULL__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fhls_5ffull_5ffunc_3c_20float_20_3e_94',['BGR_to_HLS_FULL_func< float >',['https://docs.opencv.org/4.2.0/d7/db4/structcv_1_1cudev_1_1BGR__to__HLS__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgr_5fto_5fhls_5ffunc_95',['BGR_to_HLS_func',['https://docs.opencv.org/4.2.0/d7/d28/structcv_1_1cudev_1_1BGR__to__HLS__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fhls_5ffunc_3c_20float_20_3e_96',['BGR_to_HLS_func< float >',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1cudev_1_1BGR__to__HLS__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgr_5fto_5fhsv4_5ffull_5ffunc_97',['BGR_to_HSV4_FULL_func',['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1cudev_1_1BGR__to__HSV4__FULL__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fhsv4_5ffull_5ffunc_3c_20float_20_3e_98',['BGR_to_HSV4_FULL_func< float >',['https://docs.opencv.org/4.2.0/d1/d5e/structcv_1_1cudev_1_1BGR__to__HSV4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgr_5fto_5fhsv4_5ffunc_99',['BGR_to_HSV4_func',['https://docs.opencv.org/4.2.0/d9/db2/structcv_1_1cudev_1_1BGR__to__HSV4__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fhsv4_5ffunc_3c_20float_20_3e_100',['BGR_to_HSV4_func< float >',['https://docs.opencv.org/4.2.0/d7/dc2/structcv_1_1cudev_1_1BGR__to__HSV4__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgr_5fto_5fhsv_5ffull_5ffunc_101',['BGR_to_HSV_FULL_func',['https://docs.opencv.org/4.2.0/d5/d12/structcv_1_1cudev_1_1BGR__to__HSV__FULL__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fhsv_5ffull_5ffunc_3c_20float_20_3e_102',['BGR_to_HSV_FULL_func< float >',['https://docs.opencv.org/4.2.0/dd/d00/structcv_1_1cudev_1_1BGR__to__HSV__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgr_5fto_5fhsv_5ffunc_103',['BGR_to_HSV_func',['https://docs.opencv.org/4.2.0/dd/d23/structcv_1_1cudev_1_1BGR__to__HSV__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fhsv_5ffunc_3c_20float_20_3e_104',['BGR_to_HSV_func< float >',['https://docs.opencv.org/4.2.0/d6/df7/structcv_1_1cudev_1_1BGR__to__HSV__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgr_5fto_5flab4_5ffunc_105',['BGR_to_Lab4_func',['https://docs.opencv.org/4.2.0/d9/df2/structcv_1_1cudev_1_1BGR__to__Lab4__func.html',1,'cv::cudev']]], + ['bgr_5fto_5flab_5ffunc_106',['BGR_to_Lab_func',['https://docs.opencv.org/4.2.0/d5/d91/structcv_1_1cudev_1_1BGR__to__Lab__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fluv4_5ffunc_107',['BGR_to_Luv4_func',['https://docs.opencv.org/4.2.0/de/d8b/structcv_1_1cudev_1_1BGR__to__Luv4__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fluv_5ffunc_108',['BGR_to_Luv_func',['https://docs.opencv.org/4.2.0/da/d92/structcv_1_1cudev_1_1BGR__to__Luv__func.html',1,'cv::cudev']]], + ['bgr_5fto_5frgb_5ffunc_109',['BGR_to_RGB_func',['https://docs.opencv.org/4.2.0/df/dd8/structcv_1_1cudev_1_1BGR__to__RGB__func.html',1,'cv::cudev']]], + ['bgr_5fto_5frgba_5ffunc_110',['BGR_to_RGBA_func',['https://docs.opencv.org/4.2.0/d8/d77/structcv_1_1cudev_1_1BGR__to__RGBA__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fxyz4_5ffunc_111',['BGR_to_XYZ4_func',['https://docs.opencv.org/4.2.0/d7/d78/structcv_1_1cudev_1_1BGR__to__XYZ4__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fxyz_5ffunc_112',['BGR_to_XYZ_func',['https://docs.opencv.org/4.2.0/d1/d61/structcv_1_1cudev_1_1BGR__to__XYZ__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fycrcb4_5ffunc_113',['BGR_to_YCrCb4_func',['https://docs.opencv.org/4.2.0/d3/d27/structcv_1_1cudev_1_1BGR__to__YCrCb4__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fycrcb_5ffunc_114',['BGR_to_YCrCb_func',['https://docs.opencv.org/4.2.0/d5/d3a/structcv_1_1cudev_1_1BGR__to__YCrCb__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fyuv4_5ffunc_115',['BGR_to_YUV4_func',['https://docs.opencv.org/4.2.0/db/d18/structcv_1_1cudev_1_1BGR__to__YUV4__func.html',1,'cv::cudev']]], + ['bgr_5fto_5fyuv_5ffunc_116',['BGR_to_YUV_func',['https://docs.opencv.org/4.2.0/d7/d5d/structcv_1_1cudev_1_1BGR__to__YUV__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fbgr_5ffunc_117',['BGRA_to_BGR_func',['https://docs.opencv.org/4.2.0/d6/d66/structcv_1_1cudev_1_1BGRA__to__BGR__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fgray_5ffunc_118',['BGRA_to_GRAY_func',['https://docs.opencv.org/4.2.0/de/d7e/structcv_1_1cudev_1_1BGRA__to__GRAY__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fhls4_5ffull_5ffunc_119',['BGRA_to_HLS4_FULL_func',['https://docs.opencv.org/4.2.0/d8/d7c/structcv_1_1cudev_1_1BGRA__to__HLS4__FULL__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fhls4_5ffull_5ffunc_3c_20float_20_3e_120',['BGRA_to_HLS4_FULL_func< float >',['https://docs.opencv.org/4.2.0/dd/d9f/structcv_1_1cudev_1_1BGRA__to__HLS4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgra_5fto_5fhls4_5ffunc_121',['BGRA_to_HLS4_func',['https://docs.opencv.org/4.2.0/dc/da3/structcv_1_1cudev_1_1BGRA__to__HLS4__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fhls4_5ffunc_3c_20float_20_3e_122',['BGRA_to_HLS4_func< float >',['https://docs.opencv.org/4.2.0/d2/d33/structcv_1_1cudev_1_1BGRA__to__HLS4__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgra_5fto_5fhls_5ffull_5ffunc_123',['BGRA_to_HLS_FULL_func',['https://docs.opencv.org/4.2.0/d9/ddf/structcv_1_1cudev_1_1BGRA__to__HLS__FULL__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fhls_5ffull_5ffunc_3c_20float_20_3e_124',['BGRA_to_HLS_FULL_func< float >',['https://docs.opencv.org/4.2.0/d0/d64/structcv_1_1cudev_1_1BGRA__to__HLS__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgra_5fto_5fhls_5ffunc_125',['BGRA_to_HLS_func',['https://docs.opencv.org/4.2.0/de/d08/structcv_1_1cudev_1_1BGRA__to__HLS__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fhls_5ffunc_3c_20float_20_3e_126',['BGRA_to_HLS_func< float >',['https://docs.opencv.org/4.2.0/d8/d90/structcv_1_1cudev_1_1BGRA__to__HLS__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgra_5fto_5fhsv4_5ffull_5ffunc_127',['BGRA_to_HSV4_FULL_func',['https://docs.opencv.org/4.2.0/d6/da1/structcv_1_1cudev_1_1BGRA__to__HSV4__FULL__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fhsv4_5ffull_5ffunc_3c_20float_20_3e_128',['BGRA_to_HSV4_FULL_func< float >',['https://docs.opencv.org/4.2.0/d4/df0/structcv_1_1cudev_1_1BGRA__to__HSV4__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgra_5fto_5fhsv4_5ffunc_129',['BGRA_to_HSV4_func',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1cudev_1_1BGRA__to__HSV4__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fhsv4_5ffunc_3c_20float_20_3e_130',['BGRA_to_HSV4_func< float >',['https://docs.opencv.org/4.2.0/d3/d25/structcv_1_1cudev_1_1BGRA__to__HSV4__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgra_5fto_5fhsv_5ffull_5ffunc_131',['BGRA_to_HSV_FULL_func',['https://docs.opencv.org/4.2.0/db/d15/structcv_1_1cudev_1_1BGRA__to__HSV__FULL__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fhsv_5ffull_5ffunc_3c_20float_20_3e_132',['BGRA_to_HSV_FULL_func< float >',['https://docs.opencv.org/4.2.0/d3/d43/structcv_1_1cudev_1_1BGRA__to__HSV__FULL__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgra_5fto_5fhsv_5ffunc_133',['BGRA_to_HSV_func',['https://docs.opencv.org/4.2.0/dc/d1f/structcv_1_1cudev_1_1BGRA__to__HSV__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fhsv_5ffunc_3c_20float_20_3e_134',['BGRA_to_HSV_func< float >',['https://docs.opencv.org/4.2.0/d9/d8a/structcv_1_1cudev_1_1BGRA__to__HSV__func_3_01float_01_4.html',1,'cv::cudev']]], + ['bgra_5fto_5flab4_5ffunc_135',['BGRA_to_Lab4_func',['https://docs.opencv.org/4.2.0/d0/de7/structcv_1_1cudev_1_1BGRA__to__Lab4__func.html',1,'cv::cudev']]], + ['bgra_5fto_5flab_5ffunc_136',['BGRA_to_Lab_func',['https://docs.opencv.org/4.2.0/d4/d7d/structcv_1_1cudev_1_1BGRA__to__Lab__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fluv4_5ffunc_137',['BGRA_to_Luv4_func',['https://docs.opencv.org/4.2.0/de/d52/structcv_1_1cudev_1_1BGRA__to__Luv4__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fluv_5ffunc_138',['BGRA_to_Luv_func',['https://docs.opencv.org/4.2.0/de/d8c/structcv_1_1cudev_1_1BGRA__to__Luv__func.html',1,'cv::cudev']]], + ['bgra_5fto_5frgb_5ffunc_139',['BGRA_to_RGB_func',['https://docs.opencv.org/4.2.0/d4/de2/structcv_1_1cudev_1_1BGRA__to__RGB__func.html',1,'cv::cudev']]], + ['bgra_5fto_5frgba_5ffunc_140',['BGRA_to_RGBA_func',['https://docs.opencv.org/4.2.0/d4/ddf/structcv_1_1cudev_1_1BGRA__to__RGBA__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fxyz4_5ffunc_141',['BGRA_to_XYZ4_func',['https://docs.opencv.org/4.2.0/d8/d57/structcv_1_1cudev_1_1BGRA__to__XYZ4__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fxyz_5ffunc_142',['BGRA_to_XYZ_func',['https://docs.opencv.org/4.2.0/de/d69/structcv_1_1cudev_1_1BGRA__to__XYZ__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fycrcb4_5ffunc_143',['BGRA_to_YCrCb4_func',['https://docs.opencv.org/4.2.0/d3/d09/structcv_1_1cudev_1_1BGRA__to__YCrCb4__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fycrcb_5ffunc_144',['BGRA_to_YCrCb_func',['https://docs.opencv.org/4.2.0/d6/dbd/structcv_1_1cudev_1_1BGRA__to__YCrCb__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fyuv4_5ffunc_145',['BGRA_to_YUV4_func',['https://docs.opencv.org/4.2.0/db/d43/structcv_1_1cudev_1_1BGRA__to__YUV4__func.html',1,'cv::cudev']]], + ['bgra_5fto_5fyuv_5ffunc_146',['BGRA_to_YUV_func',['https://docs.opencv.org/4.2.0/db/d7e/structcv_1_1cudev_1_1BGRA__to__YUV__func.html',1,'cv::cudev']]], + ['bicgstab_147',['BiCGSTAB',['https://eigen.tuxfamily.org/dox/classEigen_1_1BiCGSTAB.html',1,'Eigen']]], + ['bidirectional_5fiterator_5ftag_148',['bidirectional_iterator_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07703.html',1,'std']]], + ['bif_149',['BIF',['https://docs.opencv.org/4.2.0/dc/d12/classcv_1_1face_1_1BIF.html',1,'cv::face']]], + ['bin_5fsearch_5ftree_5fconst_5fit_5f_150',['bin_search_tree_const_it_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11635.html',1,'__gnu_pbds::detail']]], + ['bin_5fsearch_5ftree_5fconst_5fnode_5fit_5f_151',['bin_search_tree_const_node_it_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html',1,'__gnu_pbds::detail']]], + ['bin_5fsearch_5ftree_5fit_5f_152',['bin_search_tree_it_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11639.html',1,'__gnu_pbds::detail']]], + ['bin_5fsearch_5ftree_5fnode_5fit_5f_153',['bin_search_tree_node_it_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11631.html',1,'__gnu_pbds::detail']]], + ['bin_5fsearch_5ftree_5ftraits_154',['bin_search_tree_traits',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html',1,'__gnu_pbds::detail']]], + ['bin_5fsearch_5ftree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20rb_5ftree_5fnode_5f_3c_20types_5ftraits_3c_20key_2c_20mapped_2c_20_5falloc_2c_20false_20_3e_3a_3avalue_5ftype_2c_20tree_5fnode_5fmetadata_5fdispatch_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20_5falloc_20_3e_3a_3atype_2c_20_5falloc_20_3e_2c_20_5falloc_20_3e_155',['bin_search_tree_traits< Key, Mapped, Cmp_Fn, Node_Update, rb_tree_node_< types_traits< Key, Mapped, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, Mapped, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html',1,'']]], + ['bin_5fsearch_5ftree_5ftraits_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20splay_5ftree_5fnode_5f_3c_20types_5ftraits_3c_20key_2c_20mapped_2c_20_5falloc_2c_20false_20_3e_3a_3avalue_5ftype_2c_20tree_5fnode_5fmetadata_5fdispatch_3c_20key_2c_20mapped_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20_5falloc_20_3e_3a_3atype_2c_20_5falloc_20_3e_2c_20_5falloc_20_3e_156',['bin_search_tree_traits< Key, Mapped, Cmp_Fn, Node_Update, splay_tree_node_< types_traits< Key, Mapped, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, Mapped, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html',1,'']]], + ['bin_5fsearch_5ftree_5ftraits_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20node_2c_20_5falloc_20_3e_157',['bin_search_tree_traits< Key, null_type, Cmp_Fn, Node_Update, Node, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11647.html',1,'__gnu_pbds::detail']]], + ['bin_5fsearch_5ftree_5ftraits_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20rb_5ftree_5fnode_5f_3c_20types_5ftraits_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20false_20_3e_3a_3avalue_5ftype_2c_20tree_5fnode_5fmetadata_5fdispatch_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20_5falloc_20_3e_3a_3atype_2c_20_5falloc_20_3e_2c_20_5falloc_20_3e_158',['bin_search_tree_traits< Key, null_type, Cmp_Fn, Node_Update, rb_tree_node_< types_traits< Key, null_type, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, null_type, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html',1,'']]], + ['bin_5fsearch_5ftree_5ftraits_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20splay_5ftree_5fnode_5f_3c_20types_5ftraits_3c_20key_2c_20null_5ftype_2c_20_5falloc_2c_20false_20_3e_3a_3avalue_5ftype_2c_20tree_5fnode_5fmetadata_5fdispatch_3c_20key_2c_20null_5ftype_2c_20cmp_5ffn_2c_20node_5fupdate_2c_20_5falloc_20_3e_3a_3atype_2c_20_5falloc_20_3e_2c_20_5falloc_20_3e_159',['bin_search_tree_traits< Key, null_type, Cmp_Fn, Node_Update, splay_tree_node_< types_traits< Key, null_type, _Alloc, false >::value_type, tree_node_metadata_dispatch< Key, null_type, Cmp_Fn, Node_Update, _Alloc >::type, _Alloc >, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11643.html',1,'']]], + ['binary_5fcompose_160',['binary_compose',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09163.html',1,'__gnu_cxx']]], + ['binary_5ffunction_161',['binary_function',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'cv::cudev::binary_function< _Arg1, _Arg2, _Result >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'std::binary_function< _Arg1, _Arg2, _Result >']]], + ['binary_5ffunction_3c_20_5f_5fshared_5fptr_3c_20_5ftp_2c_20_5flp_20_3e_2c_20_5f_5fshared_5fptr_3c_20_5ftp_2c_20_5flp_20_3e_2c_20bool_20_3e_162',['binary_function< __shared_ptr< _Tp, _Lp >, __shared_ptr< _Tp, _Lp >, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20_5f_5fweak_5fptr_3c_20_5ftp_2c_20_5flp_20_3e_2c_20_5f_5fweak_5fptr_3c_20_5ftp_2c_20_5flp_20_3e_2c_20bool_20_3e_163',['binary_function< __weak_ptr< _Tp, _Lp >, __weak_ptr< _Tp, _Lp >, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20_5farg1_2c_20_5farg2_2c_20_5farg1_20_3e_164',['binary_function< _Arg1, _Arg2, _Arg1 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20_5farg1_2c_20_5farg2_2c_20_5farg2_20_3e_165',['binary_function< _Arg1, _Arg2, _Arg2 >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20_5fpredicate_3a_3afirst_5fargument_5ftype_2c_20_5fpredicate_3a_3asecond_5fargument_5ftype_2c_20bool_20_3e_166',['binary_function< _Predicate::first_argument_type, _Predicate::second_argument_type, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20_5ft1_2c_20_5ft2_2c_20_5fres_20_3e_167',['binary_function< _T1, _T2, _Res >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20_5ft1_2c_20_5ft2_2c_20bool_20_3e_168',['binary_function< _T1, _T2, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20_5ftp_20_2a_2c_20_5farg_2c_20_5fret_20_3e_169',['binary_function< _Tp *, _Arg, _Ret >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20_5ftp_20_2a_2c_20_5ftp_20_2a_2c_20bool_20_3e_170',['binary_function< _Tp *, _Tp *, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20_5ftp_2c_20_5farg_2c_20_5fret_20_3e_171',['binary_function< _Tp, _Arg, _Ret >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20_5ftp_2c_20_5ftp_2c_20_5ftp_20_3e_172',['binary_function< _Tp, _Tp, _Tp >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20_5ftp_2c_20_5ftp_2c_20bool_20_3e_173',['binary_function< _Tp, _Tp, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20_5ftp1_2c_20_5ftp2_2c_20_5fresult_20_3e_174',['binary_function< _Tp1, _Tp2, _Result >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20const_20_5ftp_20_2a_2c_20_5farg_2c_20_5fret_20_3e_175',['binary_function< const _Tp *, _Arg, _Ret >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20double_2c_20double_2c_20double_20_3e_176',['binary_function< double, double, double >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20float_2c_20float_2c_20float_20_3e_177',['binary_function< float, float, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20int_2c_20int_2c_20float_20_3e_178',['binary_function< int, int, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20int_2c_20int_2c_20int_20_3e_179',['binary_function< int, int, int >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20predicate_3a_3afirst_5fargument_5ftype_2c_20predicate_3a_3asecond_5fargument_5ftype_2c_20predicate_3a_3aresult_5ftype_20_3e_180',['binary_function< Predicate::first_argument_type, Predicate::second_argument_type, Predicate::result_type >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20rope_3c_20_5fchart_2c_20_5falloc_20_3e_2c_20rope_3c_20_5fchart_2c_20_5falloc_20_3e_2c_20rope_3c_20_5fchart_2c_20_5falloc_20_3e_20_3e_181',['binary_function< rope< _CharT, _Alloc >, rope< _CharT, _Alloc >, rope< _CharT, _Alloc > >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20schar_2c_20schar_2c_20float_20_3e_182',['binary_function< schar, schar, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20schar_2c_20schar_2c_20schar_20_3e_183',['binary_function< schar, schar, schar >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20shared_5fptr_3c_20_5ftp_20_3e_2c_20shared_5fptr_3c_20_5ftp_20_3e_2c_20bool_20_3e_184',['binary_function< shared_ptr< _Tp >, shared_ptr< _Tp >, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20short_2c_20short_2c_20float_20_3e_185',['binary_function< short, short, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20short_2c_20short_2c_20short_20_3e_186',['binary_function< short, short, short >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20std_3a_3apair_3c_20_5ft1_2c_20_5ft2_20_3e_2c_20std_3a_3apair_3c_20_5ft1_2c_20_5ft2_20_3e_2c_20bool_20_3e_187',['binary_function< std::pair< _T1, _T2 >, std::pair< _T1, _T2 >, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20t_2c_20float_2c_20float_20_3e_188',['binary_function< T, float, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20t_2c_20t_2c_20functional_5fdetail_3a_3afloattype_3c_20t_20_3e_3a_3atype_20_3e_189',['binary_function< T, T, functional_detail::FloatType< T >::type >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20t_2c_20t_2c_20makevec_3c_20uchar_2c_20vectraits_3c_20t_20_3e_3a_3acn_20_3e_3a_3atype_20_3e_190',['binary_function< T, T, MakeVec< uchar, VecTraits< T >::cn >::type >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20t_2c_20t_2c_20t_20_3e_191',['binary_function< T, T, T >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20t1_2c_20t2_2c_20t1_20_3e_192',['binary_function< T1, T2, T1 >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20t1_2c_20t2_2c_20t2_20_3e_193',['binary_function< T1, T2, T2 >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20uchar_2c_20uchar_2c_20float_20_3e_194',['binary_function< uchar, uchar, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20uchar_2c_20uchar_2c_20uchar_20_3e_195',['binary_function< uchar, uchar, uchar >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20uint_2c_20uint_2c_20float_20_3e_196',['binary_function< uint, uint, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20uint_2c_20uint_2c_20uint_20_3e_197',['binary_function< uint, uint, uint >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20ushort_2c_20ushort_2c_20float_20_3e_198',['binary_function< ushort, ushort, float >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20ushort_2c_20ushort_2c_20ushort_20_3e_199',['binary_function< ushort, ushort, ushort >',['https://docs.opencv.org/4.2.0/d6/ddf/structcv_1_1cudev_1_1binary__function.html',1,'']]], + ['binary_5ffunction_3c_20value_5ftype_2c_20value_5ftype_2c_20bool_20_3e_200',['binary_function< value_type, value_type, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20void_2c_20void_2c_20bool_20_3e_201',['binary_function< void, void, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5ffunction_3c_20weak_5fptr_3c_20_5ftp_20_3e_2c_20weak_5fptr_3c_20_5ftp_20_3e_2c_20bool_20_3e_202',['binary_function< weak_ptr< _Tp >, weak_ptr< _Tp >, bool >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07351.html',1,'']]], + ['binary_5fheap_203',['binary_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11567.html',1,'__gnu_pbds::detail']]], + ['binary_5fheap_5fconst_5fiterator_5f_204',['binary_heap_const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html',1,'__gnu_pbds::detail']]], + ['binary_5fheap_5fpoint_5fconst_5fiterator_5f_205',['binary_heap_point_const_iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html',1,'__gnu_pbds::detail']]], + ['binary_5fheap_5ftag_206',['binary_heap_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11283.html',1,'__gnu_pbds']]], + ['binary_5fnegate_207',['binary_negate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07591.html',1,'std']]], + ['binarydescriptor_208',['BinaryDescriptor',['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html',1,'cv::line_descriptor']]], + ['binarydescriptormatcher_209',['BinaryDescriptorMatcher',['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html',1,'cv::line_descriptor']]], + ['binarynegate_210',['BinaryNegate',['https://docs.opencv.org/4.2.0/d1/d81/structcv_1_1cudev_1_1BinaryNegate.html',1,'cv::cudev']]], + ['binarytransformptr_211',['BinaryTransformPtr',['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html',1,'cv::cudev']]], + ['binarytransformptrsz_212',['BinaryTransformPtrSz',['https://docs.opencv.org/4.2.0/d1/d0a/structcv_1_1cudev_1_1BinaryTransformPtrSz.html',1,'cv::cudev']]], + ['binarytupleadapter_213',['BinaryTupleAdapter',['https://docs.opencv.org/4.2.0/dc/da3/structcv_1_1cudev_1_1BinaryTupleAdapter.html',1,'cv::cudev']]], + ['binder1st_214',['Binder1st',['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1Binder1st.html',1,'cv::cudev']]], + ['binder1st_215',['binder1st',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08519.html',1,'std']]], + ['binder2nd_216',['Binder2nd',['https://docs.opencv.org/4.2.0/d6/db4/structcv_1_1cudev_1_1Binder2nd.html',1,'cv::cudev']]], + ['binder2nd_217',['binder2nd',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08523.html',1,'std']]], + ['binomial_5fdistribution_218',['binomial_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html',1,'std']]], + ['binomial_5fheap_219',['binomial_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11615.html',1,'__gnu_pbds::detail']]], + ['binomial_5fheap_5fbase_220',['binomial_heap_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11619.html',1,'__gnu_pbds::detail']]], + ['binomial_5fheap_5ftag_221',['binomial_heap_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11275.html',1,'__gnu_pbds']]], + ['bit_5fand_222',['bit_and',['https://docs.opencv.org/4.2.0/d9/de7/structcv_1_1cudev_1_1bit__and.html',1,'cv::cudev']]], + ['bit_5flshift_223',['bit_lshift',['https://docs.opencv.org/4.2.0/d3/d65/structcv_1_1cudev_1_1bit__lshift.html',1,'cv::cudev']]], + ['bit_5fnot_224',['bit_not',['https://docs.opencv.org/4.2.0/d0/d8a/structcv_1_1cudev_1_1bit__not.html',1,'cv::cudev']]], + ['bit_5for_225',['bit_or',['https://docs.opencv.org/4.2.0/dd/d1c/structcv_1_1cudev_1_1bit__or.html',1,'cv::cudev']]], + ['bit_5frshift_226',['bit_rshift',['https://docs.opencv.org/4.2.0/d4/d2a/structcv_1_1cudev_1_1bit__rshift.html',1,'cv::cudev']]], + ['bit_5fxor_227',['bit_xor',['https://docs.opencv.org/4.2.0/df/d44/structcv_1_1cudev_1_1bit__xor.html',1,'cv::cudev']]], + ['bitmap_5fallocator_228',['bitmap_allocator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10295.html',1,'__gnu_cxx']]], + ['bitset_229',['bitset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08831.html',1,'std::__debug::bitset< _Nb >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09099.html',1,'std::__profile::bitset< _Nb >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html',1,'std::bitset< _Nb >']]], + ['bitset_3c_20n_5flimit_5fswitch_20_3e_230',['bitset< N_LIMIT_SWITCH >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html',1,'std']]], + ['blanklayer_231',['BlankLayer',['https://docs.opencv.org/4.2.0/d8/d2d/classcv_1_1dnn_1_1BlankLayer.html',1,'cv::dnn']]], + ['blender_232',['Blender',['https://docs.opencv.org/4.2.0/d6/d4a/classcv_1_1detail_1_1Blender.html',1,'cv::detail']]], + ['block_233',['Block',['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1Block.html',1,'cv::cudev::Block'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'Eigen::Block< class, BlockRows, BlockCols, InnerPanel >']]], + ['block_3c_20const_20eigen_3a_3amatrix_2c_20ambientdimatcompiletime_2c_201_20_3e_234',['Block< const Eigen::Matrix, AmbientDimAtCompileTime, 1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'']]], + ['block_3c_20constmatrixtype_2c_20dim_2c_201_2c_21_28internal_3a_3atraits_3c_20eigen_3a_3amatrix_20_3e_3a_3aflags_20_26rowmajorbit_29_3e_235',['Block< ConstMatrixType, Dim, 1,!(internal::traits< Eigen::Matrix >::Flags &RowMajorBit)>',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'']]], + ['block_3c_20constmatrixtype_2c_20dim_2c_201_2c_21_28internal_3a_3atraits_3c_20matrixtype_20_3e_3a_3aflags_20_26rowmajorbit_29_3e_236',['Block< ConstMatrixType, Dim, 1,!(internal::traits< MatrixType >::Flags &RowMajorBit)>',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'Eigen']]], + ['block_3c_20constmatrixtype_2c_20dim_2c_20dim_2c_20int_28mode_29_3d_3d_28affinecompact_29_20_26_26_28int_28options_29_26rowmajor_29_3d_3d0_20_3e_237',['Block< ConstMatrixType, Dim, Dim, int(Mode)==(AffineCompact) &&(int(Options)&RowMajor)==0 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'Block< ConstMatrixType, Dim, Dim, int(Mode)==(AffineCompact) &&(int(Options)&RowMajor)==0 >'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'Eigen::Block< ConstMatrixType, Dim, Dim, int(Mode)==(AffineCompact) &&(int(Options)&RowMajor)==0 >']]], + ['block_3c_20vectortype_2c_20internal_3a_3atraits_3c_20vectortype_20_3e_3a_3aflags_20_26rowmajorbit_20_3f_201_20_3asize_2c_20internal_3a_3atraits_3c_20vectortype_20_3e_3a_3aflags_20_26rowmajorbit_20_3f_20size_20_3a1_20_3e_238',['Block< VectorType, internal::traits< VectorType >::Flags &RowMajorBit ? 1 :Size, internal::traits< VectorType >::Flags &RowMajorBit ? Size :1 >',['https://eigen.tuxfamily.org/dox/classEigen_1_1Block.html',1,'']]], + ['blockimpl_3c_20xprtype_2c_20blockrows_2c_20blockcols_2c_20innerpanel_2c_20sparse_20_3e_239',['BlockImpl< XprType, BlockRows, BlockCols, InnerPanel, Sparse >',['https://eigen.tuxfamily.org/dox/classEigen_1_1BlockImpl_3_01XprType_00_01BlockRows_00_01BlockCols_00_01InnerPanel_00_01Sparse_01_4.html',1,'Eigen']]], + ['blockmeanhash_240',['BlockMeanHash',['https://docs.opencv.org/4.2.0/df/d55/classcv_1_1img__hash_1_1BlockMeanHash.html',1,'cv::img_hash']]], + ['blockschannelscompensator_241',['BlocksChannelsCompensator',['https://docs.opencv.org/4.2.0/d3/dab/classcv_1_1detail_1_1BlocksChannelsCompensator.html',1,'cv::detail']]], + ['blockscompensator_242',['BlocksCompensator',['https://docs.opencv.org/4.2.0/da/df4/classcv_1_1detail_1_1BlocksCompensator.html',1,'cv::detail']]], + ['blocksgaincompensator_243',['BlocksGainCompensator',['https://docs.opencv.org/4.2.0/d7/d81/classcv_1_1detail_1_1BlocksGainCompensator.html',1,'cv::detail']]], + ['bnlllayer_244',['BNLLLayer',['https://docs.opencv.org/4.2.0/d0/d87/classcv_1_1dnn_1_1BNLLLayer.html',1,'cv::dnn']]], + ['board_245',['Board',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1aruco_1_1Board.html',1,'cv::aruco']]], + ['bool_5fset_246',['bool_set',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09779.html',1,'std::tr2']]], + ['boost_247',['Boost',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html',1,'cv::ml']]], + ['boostdesc_248',['BoostDesc',['https://docs.opencv.org/4.2.0/d1/dfd/classcv_1_1xfeatures2d_1_1BoostDesc.html',1,'cv::xfeatures2d']]], + ['border_249',['Border',['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html',1,'cv::gapi::fluid']]], + ['bowimgdescriptorextractor_250',['BOWImgDescriptorExtractor',['https://docs.opencv.org/4.2.0/d2/d6b/classcv_1_1BOWImgDescriptorExtractor.html',1,'cv']]], + ['bowkmeanstrainer_251',['BOWKMeansTrainer',['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html',1,'cv']]], + ['bowtrainer_252',['BOWTrainer',['https://docs.opencv.org/4.2.0/d5/d14/classcv_1_1BOWTrainer.html',1,'cv']]], + ['box_253',['Box',['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1ximgproc_1_1Box.html',1,'cv::ximgproc']]], + ['branch_5fpolicy_254',['branch_policy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11651.html',1,'__gnu_pbds::detail']]], + ['branch_5fpolicy_3c_20node_5fcitr_2c_20node_5fcitr_2c_20_5falloc_20_3e_255',['branch_policy< Node_CItr, Node_CItr, _Alloc >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11655.html',1,'__gnu_pbds::detail']]], + ['brdbase_256',['BrdBase',['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html',1,'cv::cudev']]], + ['brdconstant_257',['BrdConstant',['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html',1,'cv::cudev']]], + ['brdreflect_258',['BrdReflect',['https://docs.opencv.org/4.2.0/dc/dff/structcv_1_1cudev_1_1BrdReflect.html',1,'cv::cudev']]], + ['brdreflect101_259',['BrdReflect101',['https://docs.opencv.org/4.2.0/d3/d12/structcv_1_1cudev_1_1BrdReflect101.html',1,'cv::cudev']]], + ['brdreplicate_260',['BrdReplicate',['https://docs.opencv.org/4.2.0/d7/de8/structcv_1_1cudev_1_1BrdReplicate.html',1,'cv::cudev']]], + ['brdwrap_261',['BrdWrap',['https://docs.opencv.org/4.2.0/da/d69/structcv_1_1cudev_1_1BrdWrap.html',1,'cv::cudev']]], + ['briefdescriptorextractor_262',['BriefDescriptorExtractor',['https://docs.opencv.org/4.2.0/d1/d93/classcv_1_1xfeatures2d_1_1BriefDescriptorExtractor.html',1,'cv::xfeatures2d']]], + ['brisk_263',['BRISK',['https://docs.opencv.org/4.2.0/de/dbf/classcv_1_1BRISK.html',1,'cv']]], + ['broxopticalflow_264',['BroxOpticalFlow',['https://docs.opencv.org/4.2.0/d7/d18/classcv_1_1cuda_1_1BroxOpticalFlow.html',1,'cv::cuda::BroxOpticalFlow'],['https://docs.opencv.org/4.2.0/dc/dd1/classcv_1_1superres_1_1BroxOpticalFlow.html',1,'cv::superres::BroxOpticalFlow']]], + ['buffer_265',['Buffer',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html',1,'cv::gapi::fluid::Buffer'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html',1,'cv::ogl::Buffer']]], + ['bufferpool_266',['BufferPool',['https://docs.opencv.org/4.2.0/d5/d08/classcv_1_1cuda_1_1BufferPool.html',1,'cv::cuda']]], + ['bufferpoolcontroller_267',['BufferPoolController',['https://docs.opencv.org/4.2.0/d4/dad/classcv_1_1BufferPoolController.html',1,'cv']]], + ['bundleadjusteraffine_268',['BundleAdjusterAffine',['https://docs.opencv.org/4.2.0/d6/d8d/classcv_1_1detail_1_1BundleAdjusterAffine.html',1,'cv::detail']]], + ['bundleadjusteraffinepartial_269',['BundleAdjusterAffinePartial',['https://docs.opencv.org/4.2.0/d4/dbb/classcv_1_1detail_1_1BundleAdjusterAffinePartial.html',1,'cv::detail']]], + ['bundleadjusterbase_270',['BundleAdjusterBase',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html',1,'cv::detail']]], + ['bundleadjusterray_271',['BundleAdjusterRay',['https://docs.opencv.org/4.2.0/da/d7c/classcv_1_1detail_1_1BundleAdjusterRay.html',1,'cv::detail']]], + ['bundleadjusterreproj_272',['BundleAdjusterReproj',['https://docs.opencv.org/4.2.0/dc/d54/classcv_1_1detail_1_1BundleAdjusterReproj.html',1,'cv::detail']]], + ['byte_5fcontainer_5fwith_5fsubtype_273',['byte_container_with_subtype',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype.html',1,'nlohmann']]] ]; diff --git a/search/classes_d.js b/search/classes_d.js index 22542f36..93e0ad39 100644 --- a/search/classes_d.js +++ b/search/classes_d.js @@ -102,9 +102,9 @@ var searchData= ['maskgenerator_99',['MaskGenerator',['https://docs.opencv.org/4.2.0/d6/dfb/classcv_1_1BaseCascadeClassifier_1_1MaskGenerator.html',1,'cv::BaseCascadeClassifier']]], ['mat_100',['Mat',['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html',1,'cv::gapi::own::Mat'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html',1,'cv::Mat']]], ['mat_5f_101',['Mat_',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'cv']]], - ['mat_5f_3c_20double_20_3e_102',['Mat_< double >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], + ['mat_5f_3c_20double_20_3e_102',['Mat_< double >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'cv::Mat_< double >'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'Mat_< double >']]], ['mat_5f_3c_20float_20_3e_103',['Mat_< float >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], - ['mat_5f_3c_20int_20_3e_104',['Mat_< int >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], + ['mat_5f_3c_20int_20_3e_104',['Mat_< int >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'cv::Mat_< int >'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'Mat_< int >']]], ['mat_5f_3c_20uchar_20_3e_105',['Mat_< uchar >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], ['mat_5f_3c_20unsigned_20char_20_3e_106',['Mat_< unsigned char >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html',1,'']]], ['matallocator_107',['MatAllocator',['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html',1,'cv']]], @@ -164,119 +164,126 @@ var searchData= ['matstep_161',['MatStep',['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html',1,'cv']]], ['matx_162',['Matx',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], ['matx_3c_20_5ftp_2c_20cn_2c_201_20_3e_163',['Matx< _Tp, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_201_2c_203_20_3e_164',['Matx< double, 1, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], + ['matx_3c_20double_2c_201_2c_203_20_3e_164',['Matx< double, 1, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< double, 1, 3 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< double, 1, 3 >']]], ['matx_3c_20double_2c_202_2c_202_20_3e_165',['Matx< double, 2, 2 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_202_2c_203_20_3e_166',['Matx< double, 2, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_203_2c_203_20_3e_167',['Matx< double, 3, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_203_2c_204_20_3e_168',['Matx< double, 3, 4 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_204_2c_204_20_3e_169',['Matx< double, 4, 4 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20double_2c_20cn_2c_201_20_3e_170',['Matx< double, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20float_2c_202_2c_203_20_3e_171',['Matx< float, 2, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20float_2c_203_2c_203_20_3e_172',['Matx< float, 3, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20float_2c_20cn_2c_201_20_3e_173',['Matx< float, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20float_5ftype_2c_204_2c_204_20_3e_174',['Matx< float_type, 4, 4 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matx_3c_20int_2c_20cn_2c_201_20_3e_175',['Matx< int, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], - ['matxcommainitializer_176',['MatxCommaInitializer',['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html',1,'cv']]], - ['matxcommainitializer_3c_20_5ftp_2c_20m_2c_201_20_3e_177',['MatxCommaInitializer< _Tp, m, 1 >',['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html',1,'']]], - ['max_178',['Max',['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1cudev_1_1Max.html',1,'cv::cudev']]], - ['maximum_179',['maximum',['https://docs.opencv.org/4.2.0/d4/d31/structcv_1_1cudev_1_1maximum.html',1,'cv::cudev']]], - ['maximum_3c_20double_20_3e_180',['maximum< double >',['https://docs.opencv.org/4.2.0/dc/d65/structcv_1_1cudev_1_1maximum_3_01double_01_4.html',1,'cv::cudev']]], - ['maximum_3c_20float_20_3e_181',['maximum< float >',['https://docs.opencv.org/4.2.0/d4/d1e/structcv_1_1cudev_1_1maximum_3_01float_01_4.html',1,'cv::cudev']]], - ['maximum_3c_20schar_20_3e_182',['maximum< schar >',['https://docs.opencv.org/4.2.0/df/df2/structcv_1_1cudev_1_1maximum_3_01schar_01_4.html',1,'cv::cudev']]], - ['maximum_3c_20short_20_3e_183',['maximum< short >',['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1maximum_3_01short_01_4.html',1,'cv::cudev']]], - ['maximum_3c_20uchar_20_3e_184',['maximum< uchar >',['https://docs.opencv.org/4.2.0/dc/d84/structcv_1_1cudev_1_1maximum_3_01uchar_01_4.html',1,'cv::cudev']]], - ['maximum_3c_20uint_20_3e_185',['maximum< uint >',['https://docs.opencv.org/4.2.0/d8/dfa/structcv_1_1cudev_1_1maximum_3_01uint_01_4.html',1,'cv::cudev']]], - ['maximum_3c_20ushort_20_3e_186',['maximum< ushort >',['https://docs.opencv.org/4.2.0/d0/dac/structcv_1_1cudev_1_1maximum_3_01ushort_01_4.html',1,'cv::cudev']]], - ['maxunpoollayer_187',['MaxUnpoolLayer',['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html',1,'cv::dnn']]], - ['mctkernel_188',['MCTKernel',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html',1,'cv::stereo']]], - ['meankernelintegralimage_189',['MeanKernelIntegralImage',['https://docs.opencv.org/4.2.0/de/d9b/classcv_1_1stereo_1_1MeanKernelIntegralImage.html',1,'cv::stereo']]], - ['mem_5ffun1_5fref_5ft_190',['mem_fun1_ref_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07643.html',1,'std']]], - ['mem_5ffun1_5ft_191',['mem_fun1_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07635.html',1,'std']]], - ['mem_5ffun_5fref_5ft_192',['mem_fun_ref_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07627.html',1,'std']]], - ['mem_5ffun_5ft_193',['mem_fun_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07619.html',1,'std']]], - ['mercatorprojector_194',['MercatorProjector',['https://docs.opencv.org/4.2.0/d1/daa/structcv_1_1detail_1_1MercatorProjector.html',1,'cv::detail']]], - ['mercatorwarper_195',['MercatorWarper',['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1detail_1_1MercatorWarper.html',1,'cv::detail::MercatorWarper'],['https://docs.opencv.org/4.2.0/de/d04/classcv_1_1MercatorWarper.html',1,'cv::MercatorWarper']]], - ['mergedebevec_196',['MergeDebevec',['https://docs.opencv.org/4.2.0/df/d62/classcv_1_1MergeDebevec.html',1,'cv']]], - ['mergeexposures_197',['MergeExposures',['https://docs.opencv.org/4.2.0/d6/d5e/classcv_1_1MergeExposures.html',1,'cv']]], - ['mergemertens_198',['MergeMertens',['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html',1,'cv']]], - ['mergerobertson_199',['MergeRobertson',['https://docs.opencv.org/4.2.0/d7/d5b/classcv_1_1MergeRobertson.html',1,'cv']]], - ['mersenne_5ftwister_5fengine_200',['mersenne_twister_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html',1,'std']]], - ['mersenne_5ftwister_5fengine_3c_20uint_5ffast32_5ft_2c_2032_2c_20624_2c_20397_2c_2031_2c_200x9908b0dful_2c_2011_2c_200xfffffffful_2c_207_2c_200x9d2c5680ul_2c_2015_2c_200xefc60000ul_2c_2018_2c_201812433253ul_20_3e_201',['mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html',1,'']]], - ['mesh_202',['Mesh',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html',1,'cv::viz']]], - ['messages_203',['messages',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html',1,'std']]], - ['messages_5fbase_204',['messages_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06031.html',1,'std']]], - ['messages_5fbyname_205',['messages_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06039.html',1,'std']]], - ['metahelper_206',['MetaHelper',['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1MetaHelper.html',1,'cv::detail']]], - ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20args_2e_2e_2e_20_3e_2c_20r_20_3e_207',['MetaHelper< K, std::tuple< Args... >, R >',['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1MetaHelper.html',1,'']]], - ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20args_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20r_2e_2e_2e_20_3e_20_3e_208',['MetaHelper< K, std::tuple< Args... >, std::tuple< R... > >',['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1MetaHelper.html',1,'']]], - ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20out_20_3e_209',['MetaHelper< K, std::tuple< Ins... >, Out >',['https://docs.opencv.org/4.2.0/db/dff/structcv_1_1detail_1_1MetaHelper_3_01K_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01Out_01_4.html',1,'cv::detail']]], - ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20outs_2e_2e_2e_20_3e_20_3e_210',['MetaHelper< K, std::tuple< Ins... >, std::tuple< Outs... > >',['https://docs.opencv.org/4.2.0/d1/dde/structcv_1_1detail_1_1MetaHelper_3_01K_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_1tuple_3_01Outs_8_8_8_01_4_01_4.html',1,'cv::detail']]], - ['metatype_211',['MetaType',['https://docs.opencv.org/4.2.0/db/d79/structcv_1_1detail_1_1MetaType.html',1,'cv::detail']]], - ['metatype_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_212',['MetaType< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/d4/d91/structcv_1_1detail_1_1MetaType_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], - ['metatype_3c_20cv_3a_3agmat_20_3e_213',['MetaType< cv::GMat >',['https://docs.opencv.org/4.2.0/d0/dcf/structcv_1_1detail_1_1MetaType_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], - ['metatype_3c_20cv_3a_3agmatp_20_3e_214',['MetaType< cv::GMatP >',['https://docs.opencv.org/4.2.0/dc/d9f/structcv_1_1detail_1_1MetaType_3_01cv_1_1GMatP_01_4.html',1,'cv::detail']]], - ['metatype_3c_20cv_3a_3agscalar_20_3e_215',['MetaType< cv::GScalar >',['https://docs.opencv.org/4.2.0/de/d91/structcv_1_1detail_1_1MetaType_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], - ['metisordering_216',['MetisOrdering',['https://eigen.tuxfamily.org/dox/classEigen_1_1MetisOrdering.html',1,'Eigen']]], - ['min_217',['Min',['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1Min.html',1,'cv::cudev']]], - ['minimum_218',['minimum',['https://docs.opencv.org/4.2.0/d5/dc9/structcv_1_1cudev_1_1minimum.html',1,'cv::cudev']]], - ['minimum_3c_20double_20_3e_219',['minimum< double >',['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1minimum_3_01double_01_4.html',1,'cv::cudev']]], - ['minimum_3c_20float_20_3e_220',['minimum< float >',['https://docs.opencv.org/4.2.0/d1/d9d/structcv_1_1cudev_1_1minimum_3_01float_01_4.html',1,'cv::cudev']]], - ['minimum_3c_20schar_20_3e_221',['minimum< schar >',['https://docs.opencv.org/4.2.0/d5/d75/structcv_1_1cudev_1_1minimum_3_01schar_01_4.html',1,'cv::cudev']]], - ['minimum_3c_20short_20_3e_222',['minimum< short >',['https://docs.opencv.org/4.2.0/db/d5b/structcv_1_1cudev_1_1minimum_3_01short_01_4.html',1,'cv::cudev']]], - ['minimum_3c_20uchar_20_3e_223',['minimum< uchar >',['https://docs.opencv.org/4.2.0/d8/d48/structcv_1_1cudev_1_1minimum_3_01uchar_01_4.html',1,'cv::cudev']]], - ['minimum_3c_20uint_20_3e_224',['minimum< uint >',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1cudev_1_1minimum_3_01uint_01_4.html',1,'cv::cudev']]], - ['minimum_3c_20ushort_20_3e_225',['minimum< ushort >',['https://docs.opencv.org/4.2.0/de/dfa/structcv_1_1cudev_1_1minimum_3_01ushort_01_4.html',1,'cv::cudev']]], - ['minproblemsolver_226',['MinProblemSolver',['https://docs.opencv.org/4.2.0/df/d11/classcv_1_1MinProblemSolver.html',1,'cv']]], - ['minus_227',['minus',['https://docs.opencv.org/4.2.0/da/df1/structcv_1_1cudev_1_1minus.html',1,'cv::cudev::minus< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07359.html',1,'std::minus< class >']]], - ['minus_3c_20void_20_3e_228',['minus< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07383.html',1,'std']]], - ['mishlayer_229',['MishLayer',['https://docs.opencv.org/4.2.0/d4/da1/classcv_1_1dnn_1_1MishLayer.html',1,'cv::dnn']]], - ['missioncontrolprotocol_230',['MissionControlProtocol',['../classnet_1_1mc_1_1MissionControlProtocol.html',1,'net::mc']]], - ['mod_5fbased_5frange_5fhashing_231',['mod_based_range_hashing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11739.html',1,'__gnu_pbds::detail']]], - ['modality_232',['Modality',['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html',1,'cv::linemod']]], - ['model_233',['Model',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html',1,'cv::dnn::Model'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html',1,'cv::face::FacemarkAAM::Model']]], - ['modifiedcscensus_234',['ModifiedCsCensus',['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html',1,'cv::stereo']]], - ['modulus_235',['modulus',['https://docs.opencv.org/4.2.0/d7/d7f/structcv_1_1cudev_1_1modulus.html',1,'cv::cudev::modulus< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07371.html',1,'std::modulus< class >']]], - ['modulus_3c_20void_20_3e_236',['modulus< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07395.html',1,'std']]], - ['moments_237',['Moments',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html',1,'cv']]], - ['money_5fbase_238',['money_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06003.html',1,'std']]], - ['money_5fget_239',['money_get',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html',1,'std']]], - ['money_5fput_240',['money_put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html',1,'std']]], - ['moneypunct_241',['moneypunct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html',1,'std']]], - ['moneypunct_5fbyname_242',['moneypunct_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06019.html',1,'std']]], - ['monostate_243',['monostate',['https://docs.opencv.org/4.2.0/d5/da7/structcv_1_1util_1_1monostate.html',1,'cv::util']]], - ['moreaccuratemotionwobblesuppressor_244',['MoreAccurateMotionWobbleSuppressor',['https://docs.opencv.org/4.2.0/d8/da1/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressor.html',1,'cv::videostab']]], - ['moreaccuratemotionwobblesuppressorbase_245',['MoreAccurateMotionWobbleSuppressorBase',['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html',1,'cv::videostab']]], - ['mosaic_246',['Mosaic',['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html',1,'cv::gapi::wip::draw']]], - ['motionestimatorbase_247',['MotionEstimatorBase',['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html',1,'cv::videostab']]], - ['motionestimatorl1_248',['MotionEstimatorL1',['https://docs.opencv.org/4.2.0/d7/d29/classcv_1_1videostab_1_1MotionEstimatorL1.html',1,'cv::videostab']]], - ['motionestimatorransacl2_249',['MotionEstimatorRansacL2',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html',1,'cv::videostab']]], - ['motionfilterbase_250',['MotionFilterBase',['https://docs.opencv.org/4.2.0/dd/df4/classcv_1_1videostab_1_1MotionFilterBase.html',1,'cv::videostab']]], - ['motioninpainter_251',['MotionInpainter',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html',1,'cv::videostab']]], - ['motionsaliency_252',['MotionSaliency',['https://docs.opencv.org/4.2.0/d2/df7/classcv_1_1saliency_1_1MotionSaliency.html',1,'cv::saliency']]], - ['motionsaliencybinwangapr2014_253',['MotionSaliencyBinWangApr2014',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html',1,'cv::saliency']]], - ['motionstabilizationpipeline_254',['MotionStabilizationPipeline',['https://docs.opencv.org/4.2.0/d9/d76/classcv_1_1videostab_1_1MotionStabilizationPipeline.html',1,'cv::videostab']]], - ['mouseevent_255',['MouseEvent',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html',1,'cv::viz']]], - ['move_5fiterator_256',['move_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07675.html',1,'std']]], - ['msddetector_257',['MSDDetector',['https://docs.opencv.org/4.2.0/d0/dcf/classcv_1_1xfeatures2d_1_1MSDDetector.html',1,'cv::xfeatures2d']]], - ['mser_258',['MSER',['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html',1,'cv']]], - ['msm_5fepfl_259',['MSM_epfl',['https://docs.opencv.org/4.2.0/dc/de4/classcv_1_1datasets_1_1MSM__epfl.html',1,'cv::datasets']]], - ['msm_5fepflobj_260',['MSM_epflObj',['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html',1,'cv::datasets']]], - ['msm_5fmiddlebury_261',['MSM_middlebury',['https://docs.opencv.org/4.2.0/d2/dcc/classcv_1_1datasets_1_1MSM__middlebury.html',1,'cv::datasets']]], - ['msm_5fmiddleburyobj_262',['MSM_middleburyObj',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1datasets_1_1MSM__middleburyObj.html',1,'cv::datasets']]], - ['multibandblender_263',['MultiBandBlender',['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html',1,'cv::detail']]], - ['multicameracalibration_264',['MultiCameraCalibration',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html',1,'cv::multicalib']]], - ['multimap_265',['multimap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08731.html',1,'std::__debug::multimap< _Key, _Tp, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08927.html',1,'std::__profile::multimap< _Key, _Tp, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html',1,'std::multimap< _Key, _Tp, _Compare, _Alloc >']]], - ['multiplies_266',['multiplies',['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1cudev_1_1multiplies.html',1,'cv::cudev::multiplies< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07363.html',1,'std::multiplies< class >']]], - ['multiplies_3c_20void_20_3e_267',['multiplies< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07387.html',1,'std']]], - ['multisensorekf_268',['MultiSensorEKF',['../classfilters_1_1MultiSensorEKF.html',1,'filters']]], - ['multiset_269',['multiset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08735.html',1,'std::__debug::multiset< _Key, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08931.html',1,'std::__profile::multiset< _Key, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html',1,'std::multiset< _Key, _Compare, _Alloc >']]], - ['multitracker_270',['MultiTracker',['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html',1,'cv']]], - ['multitracker_5falt_271',['MultiTracker_Alt',['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html',1,'cv']]], - ['multitrackertld_272',['MultiTrackerTLD',['https://docs.opencv.org/4.2.0/d2/d33/classcv_1_1MultiTrackerTLD.html',1,'cv']]], - ['multiway_5fmergesort_5fexact_5ftag_273',['multiway_mergesort_exact_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09747.html',1,'__gnu_parallel']]], - ['multiway_5fmergesort_5fsampling_5ftag_274',['multiway_mergesort_sampling_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09751.html',1,'__gnu_parallel']]], - ['multiway_5fmergesort_5ftag_275',['multiway_mergesort_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09743.html',1,'__gnu_parallel']]], - ['mutex_276',['mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07191.html',1,'std']]], - ['mvkernel_277',['MVKernel',['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html',1,'cv::stereo']]], - ['mvnlayer_278',['MVNLayer',['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html',1,'cv::dnn']]] + ['matx_3c_20double_2c_202_2c_203_20_3e_166',['Matx< double, 2, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< double, 2, 3 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< double, 2, 3 >']]], + ['matx_3c_20double_2c_203_2c_201_20_3e_167',['Matx< double, 3, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20double_2c_203_2c_203_20_3e_168',['Matx< double, 3, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< double, 3, 3 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< double, 3, 3 >']]], + ['matx_3c_20double_2c_203_2c_204_20_3e_169',['Matx< double, 3, 4 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< double, 3, 4 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< double, 3, 4 >']]], + ['matx_3c_20double_2c_204_2c_201_20_3e_170',['Matx< double, 4, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20double_2c_204_2c_204_20_3e_171',['Matx< double, 4, 4 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< double, 4, 4 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< double, 4, 4 >']]], + ['matx_3c_20double_2c_20cn_2c_201_20_3e_172',['Matx< double, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], + ['matx_3c_20double_2c_20gpcpatchdescriptor_3a_3anfeatures_2c_201_20_3e_173',['Matx< double, GPCPatchDescriptor::nFeatures, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20double_2c_20nfeatures_2c_201_20_3e_174',['Matx< double, nFeatures, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20float_2c_202_2c_201_20_3e_175',['Matx< float, 2, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20float_2c_202_2c_203_20_3e_176',['Matx< float, 2, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< float, 2, 3 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< float, 2, 3 >']]], + ['matx_3c_20float_2c_203_2c_201_20_3e_177',['Matx< float, 3, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20float_2c_203_2c_203_20_3e_178',['Matx< float, 3, 3 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< float, 3, 3 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< float, 3, 3 >']]], + ['matx_3c_20float_2c_20cn_2c_201_20_3e_179',['Matx< float, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], + ['matx_3c_20float_5ftype_2c_204_2c_204_20_3e_180',['Matx< float_type, 4, 4 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv::Matx< float_type, 4, 4 >'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'Matx< float_type, 4, 4 >']]], + ['matx_3c_20int_2c_203_2c_201_20_3e_181',['Matx< int, 3, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'cv']]], + ['matx_3c_20int_2c_20cn_2c_201_20_3e_182',['Matx< int, cn, 1 >',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html',1,'']]], + ['matxcommainitializer_183',['MatxCommaInitializer',['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html',1,'cv']]], + ['matxcommainitializer_3c_20_5ftp_2c_20m_2c_201_20_3e_184',['MatxCommaInitializer< _Tp, m, 1 >',['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html',1,'']]], + ['max_185',['Max',['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1cudev_1_1Max.html',1,'cv::cudev']]], + ['maximum_186',['maximum',['https://docs.opencv.org/4.2.0/d4/d31/structcv_1_1cudev_1_1maximum.html',1,'cv::cudev']]], + ['maximum_3c_20double_20_3e_187',['maximum< double >',['https://docs.opencv.org/4.2.0/dc/d65/structcv_1_1cudev_1_1maximum_3_01double_01_4.html',1,'cv::cudev']]], + ['maximum_3c_20float_20_3e_188',['maximum< float >',['https://docs.opencv.org/4.2.0/d4/d1e/structcv_1_1cudev_1_1maximum_3_01float_01_4.html',1,'cv::cudev']]], + ['maximum_3c_20schar_20_3e_189',['maximum< schar >',['https://docs.opencv.org/4.2.0/df/df2/structcv_1_1cudev_1_1maximum_3_01schar_01_4.html',1,'cv::cudev']]], + ['maximum_3c_20short_20_3e_190',['maximum< short >',['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1maximum_3_01short_01_4.html',1,'cv::cudev']]], + ['maximum_3c_20uchar_20_3e_191',['maximum< uchar >',['https://docs.opencv.org/4.2.0/dc/d84/structcv_1_1cudev_1_1maximum_3_01uchar_01_4.html',1,'cv::cudev']]], + ['maximum_3c_20uint_20_3e_192',['maximum< uint >',['https://docs.opencv.org/4.2.0/d8/dfa/structcv_1_1cudev_1_1maximum_3_01uint_01_4.html',1,'cv::cudev']]], + ['maximum_3c_20ushort_20_3e_193',['maximum< ushort >',['https://docs.opencv.org/4.2.0/d0/dac/structcv_1_1cudev_1_1maximum_3_01ushort_01_4.html',1,'cv::cudev']]], + ['maxunpoollayer_194',['MaxUnpoolLayer',['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html',1,'cv::dnn']]], + ['mctkernel_195',['MCTKernel',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html',1,'cv::stereo']]], + ['meankernelintegralimage_196',['MeanKernelIntegralImage',['https://docs.opencv.org/4.2.0/de/d9b/classcv_1_1stereo_1_1MeanKernelIntegralImage.html',1,'cv::stereo']]], + ['mem_5ffun1_5fref_5ft_197',['mem_fun1_ref_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07643.html',1,'std']]], + ['mem_5ffun1_5ft_198',['mem_fun1_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07635.html',1,'std']]], + ['mem_5ffun_5fref_5ft_199',['mem_fun_ref_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07627.html',1,'std']]], + ['mem_5ffun_5ft_200',['mem_fun_t',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07619.html',1,'std']]], + ['mercatorprojector_201',['MercatorProjector',['https://docs.opencv.org/4.2.0/d1/daa/structcv_1_1detail_1_1MercatorProjector.html',1,'cv::detail']]], + ['mercatorwarper_202',['MercatorWarper',['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1detail_1_1MercatorWarper.html',1,'cv::detail::MercatorWarper'],['https://docs.opencv.org/4.2.0/de/d04/classcv_1_1MercatorWarper.html',1,'cv::MercatorWarper']]], + ['mergedebevec_203',['MergeDebevec',['https://docs.opencv.org/4.2.0/df/d62/classcv_1_1MergeDebevec.html',1,'cv']]], + ['mergeexposures_204',['MergeExposures',['https://docs.opencv.org/4.2.0/d6/d5e/classcv_1_1MergeExposures.html',1,'cv']]], + ['mergemertens_205',['MergeMertens',['https://docs.opencv.org/4.2.0/d7/dd6/classcv_1_1MergeMertens.html',1,'cv']]], + ['mergerobertson_206',['MergeRobertson',['https://docs.opencv.org/4.2.0/d7/d5b/classcv_1_1MergeRobertson.html',1,'cv']]], + ['mersenne_5ftwister_5fengine_207',['mersenne_twister_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html',1,'std']]], + ['mersenne_5ftwister_5fengine_3c_20uint_5ffast32_5ft_2c_2032_2c_20624_2c_20397_2c_2031_2c_200x9908b0dful_2c_2011_2c_200xfffffffful_2c_207_2c_200x9d2c5680ul_2c_2015_2c_200xefc60000ul_2c_2018_2c_201812433253ul_20_3e_208',['mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html',1,'']]], + ['mesh_209',['Mesh',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html',1,'cv::viz']]], + ['messages_210',['messages',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html',1,'std']]], + ['messages_5fbase_211',['messages_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06031.html',1,'std']]], + ['messages_5fbyname_212',['messages_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06039.html',1,'std']]], + ['metahelper_213',['MetaHelper',['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1MetaHelper.html',1,'cv::detail']]], + ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20args_2e_2e_2e_20_3e_2c_20r_20_3e_214',['MetaHelper< K, std::tuple< Args... >, R >',['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1MetaHelper.html',1,'']]], + ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20args_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20r_2e_2e_2e_20_3e_20_3e_215',['MetaHelper< K, std::tuple< Args... >, std::tuple< R... > >',['https://docs.opencv.org/4.2.0/d4/d06/structcv_1_1detail_1_1MetaHelper.html',1,'']]], + ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20out_20_3e_216',['MetaHelper< K, std::tuple< Ins... >, Out >',['https://docs.opencv.org/4.2.0/db/dff/structcv_1_1detail_1_1MetaHelper_3_01K_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01Out_01_4.html',1,'cv::detail']]], + ['metahelper_3c_20k_2c_20std_3a_3atuple_3c_20ins_2e_2e_2e_20_3e_2c_20std_3a_3atuple_3c_20outs_2e_2e_2e_20_3e_20_3e_217',['MetaHelper< K, std::tuple< Ins... >, std::tuple< Outs... > >',['https://docs.opencv.org/4.2.0/d1/dde/structcv_1_1detail_1_1MetaHelper_3_01K_00_01std_1_1tuple_3_01Ins_8_8_8_01_4_00_01std_1_1tuple_3_01Outs_8_8_8_01_4_01_4.html',1,'cv::detail']]], + ['metatype_218',['MetaType',['https://docs.opencv.org/4.2.0/db/d79/structcv_1_1detail_1_1MetaType.html',1,'cv::detail']]], + ['metatype_3c_20cv_3a_3agarray_3c_20u_20_3e_20_3e_219',['MetaType< cv::GArray< U > >',['https://docs.opencv.org/4.2.0/d4/d91/structcv_1_1detail_1_1MetaType_3_01cv_1_1GArray_3_01U_01_4_01_4.html',1,'cv::detail']]], + ['metatype_3c_20cv_3a_3agmat_20_3e_220',['MetaType< cv::GMat >',['https://docs.opencv.org/4.2.0/d0/dcf/structcv_1_1detail_1_1MetaType_3_01cv_1_1GMat_01_4.html',1,'cv::detail']]], + ['metatype_3c_20cv_3a_3agmatp_20_3e_221',['MetaType< cv::GMatP >',['https://docs.opencv.org/4.2.0/dc/d9f/structcv_1_1detail_1_1MetaType_3_01cv_1_1GMatP_01_4.html',1,'cv::detail']]], + ['metatype_3c_20cv_3a_3agscalar_20_3e_222',['MetaType< cv::GScalar >',['https://docs.opencv.org/4.2.0/de/d91/structcv_1_1detail_1_1MetaType_3_01cv_1_1GScalar_01_4.html',1,'cv::detail']]], + ['metisordering_223',['MetisOrdering',['https://eigen.tuxfamily.org/dox/classEigen_1_1MetisOrdering.html',1,'Eigen']]], + ['min_224',['Min',['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1Min.html',1,'cv::cudev']]], + ['minimum_225',['minimum',['https://docs.opencv.org/4.2.0/d5/dc9/structcv_1_1cudev_1_1minimum.html',1,'cv::cudev']]], + ['minimum_3c_20double_20_3e_226',['minimum< double >',['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1minimum_3_01double_01_4.html',1,'cv::cudev']]], + ['minimum_3c_20float_20_3e_227',['minimum< float >',['https://docs.opencv.org/4.2.0/d1/d9d/structcv_1_1cudev_1_1minimum_3_01float_01_4.html',1,'cv::cudev']]], + ['minimum_3c_20schar_20_3e_228',['minimum< schar >',['https://docs.opencv.org/4.2.0/d5/d75/structcv_1_1cudev_1_1minimum_3_01schar_01_4.html',1,'cv::cudev']]], + ['minimum_3c_20short_20_3e_229',['minimum< short >',['https://docs.opencv.org/4.2.0/db/d5b/structcv_1_1cudev_1_1minimum_3_01short_01_4.html',1,'cv::cudev']]], + ['minimum_3c_20uchar_20_3e_230',['minimum< uchar >',['https://docs.opencv.org/4.2.0/d8/d48/structcv_1_1cudev_1_1minimum_3_01uchar_01_4.html',1,'cv::cudev']]], + ['minimum_3c_20uint_20_3e_231',['minimum< uint >',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1cudev_1_1minimum_3_01uint_01_4.html',1,'cv::cudev']]], + ['minimum_3c_20ushort_20_3e_232',['minimum< ushort >',['https://docs.opencv.org/4.2.0/de/dfa/structcv_1_1cudev_1_1minimum_3_01ushort_01_4.html',1,'cv::cudev']]], + ['minproblemsolver_233',['MinProblemSolver',['https://docs.opencv.org/4.2.0/df/d11/classcv_1_1MinProblemSolver.html',1,'cv']]], + ['minus_234',['minus',['https://docs.opencv.org/4.2.0/da/df1/structcv_1_1cudev_1_1minus.html',1,'cv::cudev::minus< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07359.html',1,'std::minus< class >']]], + ['minus_3c_20void_20_3e_235',['minus< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07383.html',1,'std']]], + ['mishlayer_236',['MishLayer',['https://docs.opencv.org/4.2.0/d4/da1/classcv_1_1dnn_1_1MishLayer.html',1,'cv::dnn']]], + ['missioncontrolprotocol_237',['MissionControlProtocol',['../classnet_1_1mc_1_1MissionControlProtocol.html',1,'net::mc']]], + ['mod_5fbased_5frange_5fhashing_238',['mod_based_range_hashing',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11739.html',1,'__gnu_pbds::detail']]], + ['modality_239',['Modality',['https://docs.opencv.org/4.2.0/d5/d1c/classcv_1_1linemod_1_1Modality.html',1,'cv::linemod']]], + ['model_240',['Model',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html',1,'cv::dnn::Model'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html',1,'cv::face::FacemarkAAM::Model']]], + ['modifiedcscensus_241',['ModifiedCsCensus',['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html',1,'cv::stereo']]], + ['modulus_242',['modulus',['https://docs.opencv.org/4.2.0/d7/d7f/structcv_1_1cudev_1_1modulus.html',1,'cv::cudev::modulus< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07371.html',1,'std::modulus< class >']]], + ['modulus_3c_20void_20_3e_243',['modulus< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07395.html',1,'std']]], + ['moments_244',['Moments',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html',1,'cv']]], + ['money_5fbase_245',['money_base',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06003.html',1,'std']]], + ['money_5fget_246',['money_get',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html',1,'std']]], + ['money_5fput_247',['money_put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html',1,'std']]], + ['moneypunct_248',['moneypunct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html',1,'std']]], + ['moneypunct_5fbyname_249',['moneypunct_byname',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06019.html',1,'std']]], + ['monostate_250',['monostate',['https://docs.opencv.org/4.2.0/d5/da7/structcv_1_1util_1_1monostate.html',1,'cv::util']]], + ['moreaccuratemotionwobblesuppressor_251',['MoreAccurateMotionWobbleSuppressor',['https://docs.opencv.org/4.2.0/d8/da1/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressor.html',1,'cv::videostab']]], + ['moreaccuratemotionwobblesuppressorbase_252',['MoreAccurateMotionWobbleSuppressorBase',['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html',1,'cv::videostab']]], + ['mosaic_253',['Mosaic',['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html',1,'cv::gapi::wip::draw']]], + ['motionestimatorbase_254',['MotionEstimatorBase',['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html',1,'cv::videostab']]], + ['motionestimatorl1_255',['MotionEstimatorL1',['https://docs.opencv.org/4.2.0/d7/d29/classcv_1_1videostab_1_1MotionEstimatorL1.html',1,'cv::videostab']]], + ['motionestimatorransacl2_256',['MotionEstimatorRansacL2',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html',1,'cv::videostab']]], + ['motionfilterbase_257',['MotionFilterBase',['https://docs.opencv.org/4.2.0/dd/df4/classcv_1_1videostab_1_1MotionFilterBase.html',1,'cv::videostab']]], + ['motioninpainter_258',['MotionInpainter',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html',1,'cv::videostab']]], + ['motionsaliency_259',['MotionSaliency',['https://docs.opencv.org/4.2.0/d2/df7/classcv_1_1saliency_1_1MotionSaliency.html',1,'cv::saliency']]], + ['motionsaliencybinwangapr2014_260',['MotionSaliencyBinWangApr2014',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html',1,'cv::saliency']]], + ['motionstabilizationpipeline_261',['MotionStabilizationPipeline',['https://docs.opencv.org/4.2.0/d9/d76/classcv_1_1videostab_1_1MotionStabilizationPipeline.html',1,'cv::videostab']]], + ['mouseevent_262',['MouseEvent',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html',1,'cv::viz']]], + ['move_5fiterator_263',['move_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07675.html',1,'std']]], + ['msddetector_264',['MSDDetector',['https://docs.opencv.org/4.2.0/d0/dcf/classcv_1_1xfeatures2d_1_1MSDDetector.html',1,'cv::xfeatures2d']]], + ['mser_265',['MSER',['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html',1,'cv']]], + ['msm_5fepfl_266',['MSM_epfl',['https://docs.opencv.org/4.2.0/dc/de4/classcv_1_1datasets_1_1MSM__epfl.html',1,'cv::datasets']]], + ['msm_5fepflobj_267',['MSM_epflObj',['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html',1,'cv::datasets']]], + ['msm_5fmiddlebury_268',['MSM_middlebury',['https://docs.opencv.org/4.2.0/d2/dcc/classcv_1_1datasets_1_1MSM__middlebury.html',1,'cv::datasets']]], + ['msm_5fmiddleburyobj_269',['MSM_middleburyObj',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1datasets_1_1MSM__middleburyObj.html',1,'cv::datasets']]], + ['multibandblender_270',['MultiBandBlender',['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html',1,'cv::detail']]], + ['multicameracalibration_271',['MultiCameraCalibration',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html',1,'cv::multicalib']]], + ['multimap_272',['multimap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08731.html',1,'std::__debug::multimap< _Key, _Tp, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08927.html',1,'std::__profile::multimap< _Key, _Tp, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html',1,'std::multimap< _Key, _Tp, _Compare, _Alloc >']]], + ['multiplies_273',['multiplies',['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1cudev_1_1multiplies.html',1,'cv::cudev::multiplies< class >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07363.html',1,'std::multiplies< class >']]], + ['multiplies_3c_20void_20_3e_274',['multiplies< void >',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07387.html',1,'std']]], + ['multisensorekf_275',['MultiSensorEKF',['../classfilters_1_1MultiSensorEKF.html',1,'filters']]], + ['multiset_276',['multiset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08735.html',1,'std::__debug::multiset< _Key, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08931.html',1,'std::__profile::multiset< _Key, _Compare, _Allocator >'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html',1,'std::multiset< _Key, _Compare, _Alloc >']]], + ['multitracker_277',['MultiTracker',['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html',1,'cv']]], + ['multitracker_5falt_278',['MultiTracker_Alt',['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html',1,'cv']]], + ['multitrackertld_279',['MultiTrackerTLD',['https://docs.opencv.org/4.2.0/d2/d33/classcv_1_1MultiTrackerTLD.html',1,'cv']]], + ['multiway_5fmergesort_5fexact_5ftag_280',['multiway_mergesort_exact_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09747.html',1,'__gnu_parallel']]], + ['multiway_5fmergesort_5fsampling_5ftag_281',['multiway_mergesort_sampling_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09751.html',1,'__gnu_parallel']]], + ['multiway_5fmergesort_5ftag_282',['multiway_mergesort_tag',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09743.html',1,'__gnu_parallel']]], + ['mutex_283',['mutex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07191.html',1,'std']]], + ['mvkernel_284',['MVKernel',['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html',1,'cv::stereo']]], + ['mvnlayer_285',['MVNLayer',['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html',1,'cv::dnn']]] ]; diff --git a/search/enums_13.js b/search/enums_13.js index 718124e5..abc75716 100644 --- a/search/enums_13.js +++ b/search/enums_13.js @@ -10,7 +10,7 @@ var searchData= ['traitas_7',['TraitAs',['https://docs.opencv.org/4.2.0/d1/dae/namespacecv_1_1gapi_1_1ie.html#af63f38e596d0a0c4a2196532cfba3c1b',1,'cv::gapi::ie']]], ['transformtraits_8',['TransformTraits',['https://eigen.tuxfamily.org/dox/group__enums.html#gaee59a86102f150923b0cac6d4ff05107',1,'Eigen::TransformTraits'],['https://eigen.tuxfamily.org/dox/group__enums.html#gaee59a86102f150923b0cac6d4ff05107',1,'TransformTraits(Global Namespace)']]], ['transformtypes_9',['TransformTypes',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac867e23ce513e1b12612a5a34a97b264',1,'cv::xphoto::TransformTypes'],['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html#gac867e23ce513e1b12612a5a34a97b264',1,'TransformTypes(Global Namespace)']]], - ['type_10',['Type',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39',1,'cv::viz::MouseEvent::Type'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57',1,'cv::TermCriteria::Type']]], - ['type_11',['TYPE',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07',1,'cv::instr']]], + ['type_10',['TYPE',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07',1,'cv::instr']]], + ['type_11',['Type',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a17fb233b3e5af5f0460e986b3bc8ed39',1,'cv::viz::MouseEvent::Type'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57',1,'cv::TermCriteria::Type']]], ['types_12',['Types',['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a22a5db4ceb750ca68782ddb32f44562f',1,'cv::ml::Boost::Types'],['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ad993005b665024ea3c067c4cccd4e898',1,'cv::ml::EM::Types'],['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#ab654e56b6b5b0745022b7ca054ef2c1c',1,'cv::ml::KNearest::Types'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44f',1,'cv::ml::SVM::Types']]] ]; diff --git a/search/enums_6.js b/search/enums_6.js index ee0b0bba..343f1f69 100644 --- a/search/enums_6.js +++ b/search/enums_6.js @@ -2,8 +2,8 @@ var searchData= [ ['featureset_0',['FeatureSet',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga776cf8e0301b18e19be4782754274fe0',1,'cv::cuda::FeatureSet'],['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html#ga776cf8e0301b18e19be4782754274fe0',1,'FeatureSet(Global Namespace)']]], ['featuretype_1',['FeatureType',['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#aebd27314d1f03cb2b770888fb9d45b18',1,'cv::CvFeatureParams']]], - ['flags_2',['Flags',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a7afa5cd2289fb88989c0ab1b8b5d8ac2',1,'cv::ml::DTrees::Flags'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#ae8a94a2add0555b0414e85c08ff67f50',1,'cv::PCA::Flags'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af1ea864e1c19796e6264ebb3950c0b9a',1,'cv::ml::StatModel::Flags'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a4700f5207e66cdd9924bf64e34911832',1,'cv::SVD::Flags']]], - ['flags_3',['FLAGS',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612',1,'cv::instr']]], + ['flags_2',['FLAGS',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612',1,'cv::instr']]], + ['flags_3',['Flags',['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a7afa5cd2289fb88989c0ab1b8b5d8ac2',1,'cv::ml::DTrees::Flags'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#ae8a94a2add0555b0414e85c08ff67f50',1,'cv::PCA::Flags'],['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#af1ea864e1c19796e6264ebb3950c0b9a',1,'cv::ml::StatModel::Flags'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a4700f5207e66cdd9924bf64e34911832',1,'cv::SVD::Flags']]], ['float_5fdenorm_5fstyle_4',['float_denorm_style',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d4e3dd02abab45dde95b5bb4ae7fdbf',1,'std']]], ['float_5fround_5fstyle_5',['float_round_style',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53dbc8572a84ca50272f9e55a1e23e18',1,'std']]], ['floodfillflags_6',['FloodFillFlags',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gab87810a476a9cb660435a4cd7871c9eb',1,'cv::FloodFillFlags'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#gab87810a476a9cb660435a4cd7871c9eb',1,'FloodFillFlags(Global Namespace)']]], diff --git a/search/functions_1.js b/search/functions_1.js index 4b27192a..0e50059d 100644 --- a/search/functions_1.js +++ b/search/functions_1.js @@ -6,8 +6,8 @@ var searchData= ['abs2_3',['abs2',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a54cc34b64b4935307efc06d56cd531df',1,'Eigen']]], ['abs_5f_4',['abs_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ea800f8a91f1a64c8700df1715587ca',1,'cv::cudev::abs_()'],['https://docs.opencv.org/4.2.0/d8/d80/namespacecv_1_1cudev_1_1vec__math__detail.html#ad6547a7ef9396bc2aec3b23b869e4b04',1,'cv::cudev::vec_math_detail::abs_(schar val)'],['https://docs.opencv.org/4.2.0/d8/d80/namespacecv_1_1cudev_1_1vec__math__detail.html#aa8ba7e3d328eb55a45d52dc877747a4f',1,'cv::cudev::vec_math_detail::abs_(short val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ea800f8a91f1a64c8700df1715587ca',1,'abs_()(Global Namespace)']]], ['absdeterminant_5',['absDeterminant',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ac87c3bf42098d6f7324dafbc50fa83f7',1,'Eigen::ColPivHouseholderQR::absDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ac87c3bf42098d6f7324dafbc50fa83f7',1,'ColPivHouseholderQR< MatrixType >::absDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ac040c34ce3fb2b68d3f57adc0c29d526',1,'Eigen::CompleteOrthogonalDecomposition::absDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a1029e1ccc70bb8669043c5775e7f3b75',1,'Eigen::FullPivHouseholderQR::absDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#aaf4ef26c0b7affc91431ec59c92d64c3',1,'Eigen::HouseholderQR::absDeterminant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a3833903fc2bd7252803c969cdbdf45eb',1,'Eigen::SparseLU::absDeterminant()']]], - ['absdiff_6',['absdiff',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6fef31bc8c4071cbc114a758a2b79c14',1,'cv::absdiff()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gac062b283cf46ee90f74a773d3382ab54',1,'cv::cuda::absdiff()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6fef31bc8c4071cbc114a758a2b79c14',1,'absdiff(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gac062b283cf46ee90f74a773d3382ab54',1,'absdiff(InputArray src1, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['absdiff_7',['absDiff',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gaf923b18b9f56f6ecdbb23b380a99a413',1,'cv::gapi::absDiff()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gaf923b18b9f56f6ecdbb23b380a99a413',1,'absDiff()(Global Namespace)']]], + ['absdiff_6',['absDiff',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gaf923b18b9f56f6ecdbb23b380a99a413',1,'cv::gapi::absDiff()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gaf923b18b9f56f6ecdbb23b380a99a413',1,'absDiff()(Global Namespace)']]], + ['absdiff_7',['absdiff',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6fef31bc8c4071cbc114a758a2b79c14',1,'cv::absdiff()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gac062b283cf46ee90f74a773d3382ab54',1,'cv::cuda::absdiff()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6fef31bc8c4071cbc114a758a2b79c14',1,'absdiff(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gac062b283cf46ee90f74a773d3382ab54',1,'absdiff(InputArray src1, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], ['absdiff16s_8',['absdiff16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaba8def02f4712e9034995ed83d53eef0',1,'cv::hal::absdiff16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaba8def02f4712e9034995ed83d53eef0',1,'absdiff16s()(Global Namespace)']]], ['absdiff16u_9',['absdiff16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac9cf83a21446818f75ea3136ce4902f0',1,'cv::hal::absdiff16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac9cf83a21446818f75ea3136ce4902f0',1,'absdiff16u()(Global Namespace)']]], ['absdiff32f_10',['absdiff32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaec553594175dd27343eeb2ed8fa0f597',1,'cv::hal::absdiff32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaec553594175dd27343eeb2ed8fa0f597',1,'absdiff32f()(Global Namespace)']]], diff --git a/search/functions_10.js b/search/functions_10.js index d7b5b29a..a1df9d52 100644 --- a/search/functions_10.js +++ b/search/functions_10.js @@ -20,8 +20,8 @@ var searchData= ['parameters_17',['Parameters',['https://docs.opencv.org/4.2.0/d4/d80/structcv_1_1DetectionBasedTracker_1_1Parameters.html#a53c869cca43fe05698fa7b64d3e969a0',1,'cv::DetectionBasedTracker::Parameters']]], ['parametrizedline_18',['ParametrizedLine',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a43e71a77728409e15220495dc9724f04',1,'Eigen::ParametrizedLine::ParametrizedLine()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a3f26a2ac6fe39d39ba72e148f0f877ad',1,'Eigen::ParametrizedLine::ParametrizedLine(const Hyperplane< _Scalar, _AmbientDim, OtherOptions > &hyperplane)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#abf4318b4e0c2469e83ab049c9c177b80',1,'Eigen::ParametrizedLine::ParametrizedLine(const ParametrizedLine< OtherScalarType, AmbientDimAtCompileTime, OtherOptions > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a9ae3a16ee1d2a6cf09f45007451fa148',1,'Eigen::ParametrizedLine::ParametrizedLine(const VectorType &origin, const VectorType &direction)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a5261e771f71d975eaa9ebf8bc598129b',1,'Eigen::ParametrizedLine::ParametrizedLine(Index _dim)']]], ['paramgrid_19',['ParamGrid',['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a41f16ee1570e78af0d7362231138cc6c',1,'cv::ml::ParamGrid::ParamGrid()'],['https://docs.opencv.org/4.2.0/d6/dca/classcv_1_1ml_1_1ParamGrid.html#a4b8034d10d8dd7f083967176dc71d09b',1,'cv::ml::ParamGrid::ParamGrid(double _minVal, double _maxVal, double _logStep)']]], - ['params_20',['params',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a84e511f810b67411fddd2e5fbd8be6be',1,'cv::tbm::ITrackerByMatching::params()'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#a45f7b71e9007db6f13cb1535ce9b1a37',1,'cv::gapi::ie::Params::params()']]], - ['params_21',['Params',['https://docs.opencv.org/4.2.0/d6/dad/structcv_1_1ClfMilBoost_1_1Params.html#a26197941a32d517c283cdc70f37bd76d',1,'cv::ClfMilBoost::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a4f7223785437a747780c7aed2df56d2e',1,'cv::TrackerSamplerCSC::Params::Params()'],['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html#a694d900b5d61c8690d4eae9dd6b0e9dd',1,'cv::TrackerSamplerCS::Params::Params()'],['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html#ad3f4f9d15af6556af91a45162366c6d3',1,'cv::TrackerSamplerPF::Params::Params()'],['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html#afe18591df265dadb5c708db996efa863',1,'cv::TrackerFeatureHAAR::Params::Params()'],['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html#a652b1b2c3e203bbca771883fdc09d551',1,'cv::TrackerMIL::Params::Params()'],['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#a7da79b1b870c2531cb9f9443593afe2b',1,'cv::TrackerBoosting::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/dd0/structcv_1_1TrackerTLD_1_1Params.html#a75686a52571df4ab2103524426d19006',1,'cv::TrackerTLD::Params::Params()'],['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a4ec755b778a69abf371b7b1f4ef9adda',1,'cv::TrackerKCF::Params::Params()'],['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1TrackerGOTURN_1_1Params.html#a509595d2caf0e2834c59bb380e6081e3',1,'cv::TrackerGOTURN::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a2b46465864ef259b3f76e0f43ed6d872',1,'cv::TrackerCSRT::Params::Params()'],['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#a3482c25c0512983c3a26c7cd612e5557',1,'cv::TrackerMedianFlow::Params::Params()'],['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a02c43ee3252633ac4106c00a680fa747',1,'cv::face::FacemarkKazemi::Params::Params()'],['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#a0262d5324ee1d9e7333d776aa944bc86',1,'cv::face::FacemarkAAM::Params::Params()'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a60df8fda3e1925ba584122a1ea64803e',1,'cv::face::FacemarkLBF::Params::Params()'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#abe0385ab38d7f17f4255fab7047e4440',1,'cv::gapi::ie::Params::Params()'],['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#aeabdb46e1e7238a3d081eb0c6b36169b',1,'cv::SimpleBlobDetector::Params::Params()'],['https://docs.opencv.org/4.2.0/d6/d86/structcv_1_1phase__unwrapping_1_1HistogramPhaseUnwrapping_1_1Params.html#ae694509893f66be9e2c62e00b6374339',1,'cv::phase_unwrapping::HistogramPhaseUnwrapping::Params::Params()'],['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#a4cd7ec719c6c86c13faa82115c43f217',1,'cv::line_descriptor::BinaryDescriptor::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/d4d/structcv_1_1structured__light_1_1GrayCodePattern_1_1Params.html#a6b32437033328592a235f76f7ed119af',1,'cv::structured_light::GrayCodePattern::Params::Params()'],['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#ab214b6cd84af5b3e5b759e5f6f731edd',1,'cv::structured_light::SinusoidalPattern::Params::Params()']]], + ['params_20',['Params',['https://docs.opencv.org/4.2.0/d6/dad/structcv_1_1ClfMilBoost_1_1Params.html#a26197941a32d517c283cdc70f37bd76d',1,'cv::ClfMilBoost::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/dfb/structcv_1_1TrackerSamplerCSC_1_1Params.html#a4f7223785437a747780c7aed2df56d2e',1,'cv::TrackerSamplerCSC::Params::Params()'],['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html#a694d900b5d61c8690d4eae9dd6b0e9dd',1,'cv::TrackerSamplerCS::Params::Params()'],['https://docs.opencv.org/4.2.0/de/d46/structcv_1_1TrackerSamplerPF_1_1Params.html#ad3f4f9d15af6556af91a45162366c6d3',1,'cv::TrackerSamplerPF::Params::Params()'],['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html#afe18591df265dadb5c708db996efa863',1,'cv::TrackerFeatureHAAR::Params::Params()'],['https://docs.opencv.org/4.2.0/da/dae/structcv_1_1TrackerMIL_1_1Params.html#a652b1b2c3e203bbca771883fdc09d551',1,'cv::TrackerMIL::Params::Params()'],['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#a7da79b1b870c2531cb9f9443593afe2b',1,'cv::TrackerBoosting::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/dd0/structcv_1_1TrackerTLD_1_1Params.html#a75686a52571df4ab2103524426d19006',1,'cv::TrackerTLD::Params::Params()'],['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a4ec755b778a69abf371b7b1f4ef9adda',1,'cv::TrackerKCF::Params::Params()'],['https://docs.opencv.org/4.2.0/dc/d12/structcv_1_1TrackerGOTURN_1_1Params.html#a509595d2caf0e2834c59bb380e6081e3',1,'cv::TrackerGOTURN::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a2b46465864ef259b3f76e0f43ed6d872',1,'cv::TrackerCSRT::Params::Params()'],['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#a3482c25c0512983c3a26c7cd612e5557',1,'cv::TrackerMedianFlow::Params::Params()'],['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a02c43ee3252633ac4106c00a680fa747',1,'cv::face::FacemarkKazemi::Params::Params()'],['https://docs.opencv.org/4.2.0/df/d68/structcv_1_1face_1_1FacemarkAAM_1_1Params.html#a0262d5324ee1d9e7333d776aa944bc86',1,'cv::face::FacemarkAAM::Params::Params()'],['https://docs.opencv.org/4.2.0/d4/d12/structcv_1_1face_1_1FacemarkLBF_1_1Params.html#a60df8fda3e1925ba584122a1ea64803e',1,'cv::face::FacemarkLBF::Params::Params()'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#abe0385ab38d7f17f4255fab7047e4440',1,'cv::gapi::ie::Params::Params()'],['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#aeabdb46e1e7238a3d081eb0c6b36169b',1,'cv::SimpleBlobDetector::Params::Params()'],['https://docs.opencv.org/4.2.0/d6/d86/structcv_1_1phase__unwrapping_1_1HistogramPhaseUnwrapping_1_1Params.html#ae694509893f66be9e2c62e00b6374339',1,'cv::phase_unwrapping::HistogramPhaseUnwrapping::Params::Params()'],['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#a4cd7ec719c6c86c13faa82115c43f217',1,'cv::line_descriptor::BinaryDescriptor::Params::Params()'],['https://docs.opencv.org/4.2.0/d3/d4d/structcv_1_1structured__light_1_1GrayCodePattern_1_1Params.html#a6b32437033328592a235f76f7ed119af',1,'cv::structured_light::GrayCodePattern::Params::Params()'],['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#ab214b6cd84af5b3e5b759e5f6f731edd',1,'cv::structured_light::SinusoidalPattern::Params::Params()']]], + ['params_21',['params',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a84e511f810b67411fddd2e5fbd8be6be',1,'cv::tbm::ITrackerByMatching::params()'],['https://docs.opencv.org/4.2.0/d7/dda/classcv_1_1gapi_1_1ie_1_1Params.html#a45f7b71e9007db6f13cb1535ce9b1a37',1,'cv::gapi::ie::Params::params()']]], ['parent_5fpointer_22',['parent_pointer',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_afdaacce1edb7145e0434e014f0e8685a.html#afdaacce1edb7145e0434e014f0e8685a',1,'nlohmann::json_pointer']]], ['parse_23',['parse',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a15018ade392a844ea32d5188d1a0b9c6.html#a15018ade392a844ea32d5188d1a0b9c6',1,'nlohmann::basic_json::parse(InputType &&i, const parser_callback_t cb=nullptr, const bool allow_exceptions=true, const bool ignore_comments=false)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad832c70af0989389a9a104c21d2d1c5c.html#ad832c70af0989389a9a104c21d2d1c5c',1,'nlohmann::basic_json::parse(IteratorType first, IteratorType last, const parser_callback_t cb=nullptr, const bool allow_exceptions=true, const bool ignore_comments=false)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a73cf15644f04fa569f50291049d1bafd.html#a73cf15644f04fa569f50291049d1bafd',1,'nlohmann::basic_json::parse(detail::span_input_adapter &&i, const parser_callback_t cb=nullptr, const bool allow_exceptions=true, const bool ignore_comments=false)']]], ['parse_5ferror_24',['parse_error',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a60287e3bd85f489e04c83f7e3b76e613.html#a60287e3bd85f489e04c83f7e3b76e613',1,'nlohmann::json_sax']]], @@ -36,8 +36,8 @@ var searchData= ['partial_5fsort_33',['partial_sort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga91f25d546637f075de3958a25928b687',1,'std::partial_sort(_RandomAccessIterator __first, _RandomAccessIterator __middle, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6401ff7e25d2ef7a6119d894cb40eec0',1,'std::partial_sort(_RandomAccessIterator __first, _RandomAccessIterator __middle, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga91f25d546637f075de3958a25928b687',1,'partial_sort(_RandomAccessIterator __first, _RandomAccessIterator __middle, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6401ff7e25d2ef7a6119d894cb40eec0',1,'partial_sort(_RandomAccessIterator __first, _RandomAccessIterator __middle, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], ['partial_5fsort_5fcopy_34',['partial_sort_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7b262260421978833cc1b1c6b3969bb4',1,'std::partial_sort_copy(_InputIterator __first, _InputIterator __last, _RandomAccessIterator __result_first, _RandomAccessIterator __result_last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaf53e3f9d5e3c9cd4d36a0801d411e324',1,'std::partial_sort_copy(_InputIterator __first, _InputIterator __last, _RandomAccessIterator __result_first, _RandomAccessIterator __result_last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7b262260421978833cc1b1c6b3969bb4',1,'partial_sort_copy(_InputIterator __first, _InputIterator __last, _RandomAccessIterator __result_first, _RandomAccessIterator __result_last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaf53e3f9d5e3c9cd4d36a0801d411e324',1,'partial_sort_copy(_InputIterator __first, _InputIterator __last, _RandomAccessIterator __result_first, _RandomAccessIterator __result_last, _Compare __comp)(Global Namespace)']]], ['partial_5fsum_35',['partial_sum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga9151a0519f8c180edbef22197f39dd5e',1,'std::partial_sum(_InputIterator __first, _InputIterator __last, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga17bad49fa9fb1c5c41d019b16970fe9e',1,'std::partial_sum(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _BinaryOperation __binary_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga9151a0519f8c180edbef22197f39dd5e',1,'partial_sum(_InputIterator __first, _InputIterator __last, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html#ga17bad49fa9fb1c5c41d019b16970fe9e',1,'partial_sum(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _BinaryOperation __binary_op)(Global Namespace)']]], - ['partialpivlu_36',['partialPivLu',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a6199d8aaf26c1b8ac3097fdfa7733a1e',1,'Eigen::MatrixBase::partialPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a6199d8aaf26c1b8ac3097fdfa7733a1e',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::partialPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a6199d8aaf26c1b8ac3097fdfa7733a1e',1,'MatrixBase< Solve< Decomposition, RhsType > >::partialPivLu()']]], - ['partialpivlu_37',['PartialPivLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a5c04818d354f94a98786d8a44cb709c6',1,'Eigen::PartialPivLU::PartialPivLU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#acf37214aebb54d0e186ae39ac6c41bdf',1,'Eigen::PartialPivLU::PartialPivLU(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a4efc917d31d0e9d76781a97509309061',1,'Eigen::PartialPivLU::PartialPivLU(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#acf892c12d8a229b32bddc3149e32e63a',1,'Eigen::PartialPivLU::PartialPivLU(Index size)']]], + ['partialpivlu_36',['PartialPivLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a5c04818d354f94a98786d8a44cb709c6',1,'Eigen::PartialPivLU::PartialPivLU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#acf37214aebb54d0e186ae39ac6c41bdf',1,'Eigen::PartialPivLU::PartialPivLU(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a4efc917d31d0e9d76781a97509309061',1,'Eigen::PartialPivLU::PartialPivLU(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#acf892c12d8a229b32bddc3149e32e63a',1,'Eigen::PartialPivLU::PartialPivLU(Index size)']]], + ['partialpivlu_37',['partialPivLu',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a6199d8aaf26c1b8ac3097fdfa7733a1e',1,'Eigen::MatrixBase::partialPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a6199d8aaf26c1b8ac3097fdfa7733a1e',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::partialPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a6199d8aaf26c1b8ac3097fdfa7733a1e',1,'MatrixBase< Solve< Decomposition, RhsType > >::partialPivLu()']]], ['partition_38',['partition',['https://docs.opencv.org/4.2.0/d5/d38/group__core__cluster.html#ga2037c989e69b499c1aa271419f3a9b34',1,'partition()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga64c8d89411856cea58194aa69a3c37f3',1,'std::partition()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga64c8d89411856cea58194aa69a3c37f3',1,'partition()(Global Namespace)']]], ['partition_5fcopy_39',['partition_copy',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga15ed8c195c2228b62770f24b4fd9de05',1,'std::partition_copy()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga15ed8c195c2228b62770f24b4fd9de05',1,'partition_copy()(Global Namespace)']]], ['partition_5fpoint_40',['partition_point',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaca57a24221766660c3b9d83e2b3f8f97',1,'std::partition_point()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaca57a24221766660c3b9d83e2b3f8f97',1,'partition_point()(Global Namespace)']]], diff --git a/search/functions_11.js b/search/functions_11.js index c6adeeca..ff0f624a 100644 --- a/search/functions_11.js +++ b/search/functions_11.js @@ -18,8 +18,8 @@ var searchData= ['queryifcomplete_15',['queryIfComplete',['https://docs.opencv.org/4.2.0/d5/d38/classcv_1_1cuda_1_1Event.html#aa4cff2204d3bd883376e87885d7b8287',1,'cv::cuda::Event::queryIfComplete()'],['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a9fab618395d42fa31987506e42fab1b4',1,'cv::cuda::Stream::queryIfComplete()']]], ['querymemory_16',['queryMemory',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a5452c3b639a257950902a8f47fb54301',1,'cv::cuda::DeviceInfo']]], ['querypcflann_17',['queryPCFlann',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga1f97667a487faab9bd849341361db1a1',1,'cv::ppf_match_3d::queryPCFlann(void *flannIndex, Mat &pc, Mat &indices, Mat &distances)'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gac98a74b02d163b63ec68e8bf6ebcf8c6',1,'cv::ppf_match_3d::queryPCFlann(void *flannIndex, Mat &pc, Mat &indices, Mat &distances, const int numNeighbors)'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#ga1f97667a487faab9bd849341361db1a1',1,'queryPCFlann(void *flannIndex, Mat &pc, Mat &indices, Mat &distances)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gac98a74b02d163b63ec68e8bf6ebcf8c6',1,'queryPCFlann(void *flannIndex, Mat &pc, Mat &indices, Mat &distances, const int numNeighbors)(Global Namespace)']]], - ['queue_18',['queue',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#abdaacb8e25703a65fc79cbfa5fe6934b',1,'std::queue']]], - ['queue_19',['Queue',['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a702c155117f520fcd90b24ca902f861f',1,'cv::ocl::Queue::Queue()'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a62648111989b26f6067ea65ed954505e',1,'cv::ocl::Queue::Queue(const Context &c, const Device &d=Device())'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a31e41d67d14f8e12f3876e30546f7a84',1,'cv::ocl::Queue::Queue(const Queue &q)']]], + ['queue_18',['Queue',['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a702c155117f520fcd90b24ca902f861f',1,'cv::ocl::Queue::Queue()'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a62648111989b26f6067ea65ed954505e',1,'cv::ocl::Queue::Queue(const Context &c, const Device &d=Device())'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#a31e41d67d14f8e12f3876e30546f7a84',1,'cv::ocl::Queue::Queue(const Queue &q)']]], + ['queue_19',['queue',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#abdaacb8e25703a65fc79cbfa5fe6934b',1,'std::queue']]], ['quiet_5fnan_20',['quiet_NaN',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#a4a252b113edcbac0881a4ff30d94b1e1',1,'std::numeric_limits']]], ['qunitary_21',['qunitary',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga72528a5e9655482cdf6766aea985b781',1,'cv::ximgproc::qunitary()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga72528a5e9655482cdf6766aea985b781',1,'qunitary()(Global Namespace)']]], ['quoted_22',['quoted',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5bff62a35321654424cc1f6df8362cea',1,'std']]] diff --git a/search/functions_12.js b/search/functions_12.js index 839c0a86..506d4b9b 100644 --- a/search/functions_12.js +++ b/search/functions_12.js @@ -22,8 +22,8 @@ var searchData= ['range_19',['Range',['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#aafab1fe471bac7c314dcd0d678ac4e2d',1,'cv::Range::Range()'],['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#abfd8e210d1dfcbdf4e34224a621a6236',1,'cv::Range::Range(int _start, int _end)']]], ['rank_20',['rank',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a2a59aaa689613ce5ef0c9130ad33940e',1,'Eigen::ColPivHouseholderQR::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a2a59aaa689613ce5ef0c9130ad33940e',1,'ColPivHouseholderQR< MatrixType >::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#af348f64b26f8467a020062c22b748806',1,'Eigen::CompleteOrthogonalDecomposition::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aeae555220f46477818ccc94aca2de770',1,'Eigen::FullPivHouseholderQR::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a67a870aa69e699e058d04802ba0bdad9',1,'Eigen::FullPivLU::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a30b89e24f42f1692079eea31b361d26a',1,'Eigen::JacobiSVD::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a4ae2c5bdaa3c18ae5a364f65030722c3',1,'Eigen::SparseQR::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a66382a71d51b09a8526268467156fbc3',1,'Eigen::SPQR::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a30b89e24f42f1692079eea31b361d26a',1,'Eigen::SVDBase::rank()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a30b89e24f42f1692079eea31b361d26a',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::rank()']]], ['rankupdate_21',['rankUpdate',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a858dc77b65dd48248299bb6a6a758abf',1,'Eigen::LDLT::rankUpdate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a8ce93e407a2ba75489bcb6e89ea4c153',1,'Eigen::LLT::rankUpdate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a1b5afab9f9df919cba99d8ed1a260567',1,'Eigen::SelfAdjointView::rankUpdate(const MatrixBase< DerivedU > &u, const MatrixBase< DerivedV > &v, const Scalar &alpha=Scalar(1))'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#acc37b0437e0eee05f861bce511df9c77',1,'Eigen::SelfAdjointView::rankUpdate(const MatrixBase< DerivedU > &u, const Scalar &alpha=Scalar(1))'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a1b5afab9f9df919cba99d8ed1a260567',1,'SelfAdjointView< const Derived, UpLo >::rankUpdate(const MatrixBase< DerivedU > &u, const MatrixBase< DerivedV > &v, const Scalar &alpha=Scalar(1))'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#acc37b0437e0eee05f861bce511df9c77',1,'SelfAdjointView< const Derived, UpLo >::rankUpdate(const MatrixBase< DerivedU > &u, const Scalar &alpha=Scalar(1))'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#abe66734215f8d8220be0985d67901021',1,'Eigen::SparseSelfAdjointView::rankUpdate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#abe66734215f8d8220be0985d67901021',1,'SparseSelfAdjointView< const Derived, UpLo >::rankUpdate()']]], - ['ransacparams_22',['ransacParams',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#a093c536a88dacdb31f7f4deddf20a68a',1,'cv::videostab::MotionEstimatorRansacL2::ransacParams()'],['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a2b456654d89323abcff87d5fcfed9b4a',1,'cv::videostab::TranslationBasedLocalOutlierRejector::ransacParams()']]], - ['ransacparams_23',['RansacParams',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#aade72367fb9106951e3993109fb60900',1,'cv::videostab::RansacParams::RansacParams()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga0f1dea7ffe8b8d5953f3f6e50e87dde4',1,'cv::videostab::RansacParams::RansacParams(int size, float thresh, float eps, float prob)'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga0f1dea7ffe8b8d5953f3f6e50e87dde4',1,'RansacParams()(Global Namespace)']]], + ['ransacparams_22',['RansacParams',['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#aade72367fb9106951e3993109fb60900',1,'cv::videostab::RansacParams::RansacParams()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga0f1dea7ffe8b8d5953f3f6e50e87dde4',1,'cv::videostab::RansacParams::RansacParams(int size, float thresh, float eps, float prob)'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#ga0f1dea7ffe8b8d5953f3f6e50e87dde4',1,'RansacParams()(Global Namespace)']]], + ['ransacparams_23',['ransacParams',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#a093c536a88dacdb31f7f4deddf20a68a',1,'cv::videostab::MotionEstimatorRansacL2::ransacParams()'],['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a2b456654d89323abcff87d5fcfed9b4a',1,'cv::videostab::TranslationBasedLocalOutlierRejector::ransacParams()']]], ['raspberry_24',['raspberry',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a114fc719412ae919877cce3c65c03a1b',1,'cv::viz::Color']]], ['rawin_25',['rawIn',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a4d935052325c9b3a795e5b63090bfe34',1,'cv::_InputArray::rawIn(const std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a57e89a801d76b4fc28b6f0986eb5e88c',1,'cv::_InputArray::rawIn(const std::array< _Tp, _Nm > &arr)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga357a0ae6f9a5951b70fa50ec304d4025',1,'cv::rawIn()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga357a0ae6f9a5951b70fa50ec304d4025',1,'rawIn()(Global Namespace)']]], ['rawinout_26',['rawInOut',['https://docs.opencv.org/4.2.0/d0/d46/classcv_1_1__InputOutputArray.html#a556d01ad941ab25392981bd72f317813',1,'cv::_InputOutputArray::rawInOut(std::array< _Tp, _Nm > &arr)'],['https://docs.opencv.org/4.2.0/d0/d46/classcv_1_1__InputOutputArray.html#acaf3105a0b692f1167946d50016229c3',1,'cv::_InputOutputArray::rawInOut(std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0a6668770210aac2bab60edef7665338',1,'cv::rawInOut()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga0a6668770210aac2bab60edef7665338',1,'rawInOut()(Global Namespace)']]], diff --git a/search/functions_13.js b/search/functions_13.js index 25782d6e..181dd6f2 100644 --- a/search/functions_13.js +++ b/search/functions_13.js @@ -552,8 +552,8 @@ var searchData= ['setoutputmax_549',['setOutputMax',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a06962b042d9089366bc6347e608481b6',1,'cv::xphoto::SimpleWB']]], ['setoutputmin_550',['setOutputMin',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a60d1e06b122747d416c4f1563167c740',1,'cv::xphoto::SimpleWB']]], ['setoutshape_551',['setOutShape',['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a10ea7f293d12413b4a897ddc6a8714ff',1,'cv::dnn::LSTMLayer']]], - ['setp_552',['setp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'__gnu_cxx::enc_filebuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'__gnu_cxx::stdio_filebuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'__gnu_cxx::stdio_sync_filebuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_filebuf< char_type, traits_type >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_streambuf< _Elem, _Tr >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_streambuf< char, _Traits >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_streambuf< char, char_traits< char > >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'std::basic_filebuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'std::basic_streambuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'std::basic_stringbuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'std::wbuffer_convert::setp()']]], - ['setp_553',['setP',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a31b6bb5452afdb5a444920013417f018',1,'cv::xphoto::SimpleWB::setP()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aed346ecd8b15379717053254ae067d96',1,'cv::ml::SVM::setP()']]], + ['setp_552',['setP',['https://docs.opencv.org/4.2.0/d1/d8b/classcv_1_1xphoto_1_1SimpleWB.html#a31b6bb5452afdb5a444920013417f018',1,'cv::xphoto::SimpleWB::setP()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aed346ecd8b15379717053254ae067d96',1,'cv::ml::SVM::setP()']]], + ['setp_553',['setp',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'__gnu_cxx::enc_filebuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'__gnu_cxx::stdio_filebuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'__gnu_cxx::stdio_sync_filebuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_filebuf< char_type, traits_type >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_streambuf< _Elem, _Tr >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_streambuf< char, _Traits >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'basic_streambuf< char, char_traits< char > >::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'std::basic_filebuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'std::basic_streambuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'std::basic_stringbuf::setp()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ab0f1b49870f87d288a737cd9f8f9ec00',1,'std::wbuffer_convert::setp()']]], ['setp1_554',['setP1',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#ac5d2e5751dbfac3ed5bad4f1bc399c8f',1,'cv::stereo::StereoBinarySGBM::setP1()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#ae62e17715deea97b431d328869a3eace',1,'cv::StereoSGBM::setP1()']]], ['setp2_555',['setP2',['https://docs.opencv.org/4.2.0/d1/d9f/classcv_1_1stereo_1_1StereoBinarySGBM.html#a11153c7094ae6e51c1073300f246672d',1,'cv::stereo::StereoBinarySGBM::setP2()'],['https://docs.opencv.org/4.2.0/d2/d85/classcv_1_1StereoSGBM.html#a13a55a4704c988fa60e5f5902c4abfaa',1,'cv::StereoSGBM::setP2()']]], ['setpanoconfidencethresh_556',['setPanoConfidenceThresh',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a6f5e62bc1dd5d7bdb5f9313a2c21c558',1,'cv::Stitcher']]], @@ -863,210 +863,208 @@ var searchData= ['singularvalues_860',['singularValues',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a4e7bac123570c348f7ed6be909e1e474',1,'Eigen::SVDBase::singularValues()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a4e7bac123570c348f7ed6be909e1e474',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::singularValues()']]], ['sinh_861',['sinh',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9c37eab2dc7baf83809269254c9129e0',1,'Eigen::MatrixBase::sinh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9c37eab2dc7baf83809269254c9129e0',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sinh()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a9c37eab2dc7baf83809269254c9129e0',1,'MatrixBase< Solve< Decomposition, RhsType > >::sinh()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772d44272d0bd7c7b67f16ea0b85cb80',1,'cv::cudev::sinh(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga344edc16853d27c854368f389d416065',1,'cv::cudev::sinh(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41fc9242b7523253e30be1597ee66ae',1,'cv::cudev::sinh(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddc053cb31f1c990c61111d1c6743dc2',1,'cv::cudev::sinh(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ca9a17c7a0fc5a6482d44925904591',1,'cv::cudev::sinh(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07e2a3dbaccc0f8545a04c2981b6893c',1,'cv::cudev::sinh(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga041bd4a026295d1ecd49292b72bcd9b0',1,'cv::cudev::sinh(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbfadd781ca9a813fc846d412e1bb8cb',1,'cv::cudev::sinh(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f6b210903dc62269c50728eac20a3f',1,'cv::cudev::sinh(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab486c1024c95760571e684fb39a2ee85',1,'cv::cudev::sinh(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa81c2145a67198bd56929f430f2278b2',1,'cv::cudev::sinh(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931ce3aa6bc08deb00c50fb03bf47ed3',1,'cv::cudev::sinh(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b71a067f79c91cc5f62b5f422b09c9',1,'cv::cudev::sinh(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1669c360c5924edd756ae9d9536eb8e4',1,'cv::cudev::sinh(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487d5848e17ac161e3776eecf48adcf6',1,'cv::cudev::sinh(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad385a12228a01205ba34ea7926f407a0',1,'cv::cudev::sinh(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1eaa0ad7b95a36a271c0afbbd8d7a0a',1,'cv::cudev::sinh(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87c9882d3f6d3ea06cf957fecceb1af1',1,'cv::cudev::sinh(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5162f3f12ea498b9fcc5a843ed6112cd',1,'cv::cudev::sinh(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4abff00111b20ef9070fd6c52ff6c4',1,'cv::cudev::sinh(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d6389dea5e2a1eee144bade28064c6',1,'cv::cudev::sinh(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b36fcf77ae7d883572908e070ef4b8c',1,'cv::cudev::sinh(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga693a5fecbc38f4ab58b6e42a5b26c711',1,'cv::cudev::sinh(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f05f7337e5c6b1ee245f37182398e51',1,'cv::cudev::sinh(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa641ed89c52fc91f854112ab277934ee',1,'cv::cudev::sinh(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5ae3dd563be525b52f9d614b44b0008',1,'cv::cudev::sinh(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb23dca771a80de9a2629878d60385e',1,'cv::cudev::sinh(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac10c00f0dc12cd8e4eeaad51330251bf',1,'cv::cudev::sinh(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e573cff24de567a8d3c8215ec25a686',1,'cv::cudev::sinh(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1372528a6d841534331bdd0270d9b87f',1,'cv::cudev::sinh(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac5d6219259ed327d126311d05f3f77d',1,'cv::cudev::sinh(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8a3df5e8a2b664bec6d194a8efc1b11',1,'cv::cudev::sinh(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772d44272d0bd7c7b67f16ea0b85cb80',1,'sinh(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga344edc16853d27c854368f389d416065',1,'sinh(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41fc9242b7523253e30be1597ee66ae',1,'sinh(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddc053cb31f1c990c61111d1c6743dc2',1,'sinh(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ca9a17c7a0fc5a6482d44925904591',1,'sinh(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07e2a3dbaccc0f8545a04c2981b6893c',1,'sinh(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga041bd4a026295d1ecd49292b72bcd9b0',1,'sinh(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbfadd781ca9a813fc846d412e1bb8cb',1,'sinh(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97f6b210903dc62269c50728eac20a3f',1,'sinh(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab486c1024c95760571e684fb39a2ee85',1,'sinh(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa81c2145a67198bd56929f430f2278b2',1,'sinh(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931ce3aa6bc08deb00c50fb03bf47ed3',1,'sinh(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b71a067f79c91cc5f62b5f422b09c9',1,'sinh(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1669c360c5924edd756ae9d9536eb8e4',1,'sinh(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487d5848e17ac161e3776eecf48adcf6',1,'sinh(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad385a12228a01205ba34ea7926f407a0',1,'sinh(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1eaa0ad7b95a36a271c0afbbd8d7a0a',1,'sinh(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87c9882d3f6d3ea06cf957fecceb1af1',1,'sinh(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5162f3f12ea498b9fcc5a843ed6112cd',1,'sinh(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4abff00111b20ef9070fd6c52ff6c4',1,'sinh(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d6389dea5e2a1eee144bade28064c6',1,'sinh(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b36fcf77ae7d883572908e070ef4b8c',1,'sinh(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga693a5fecbc38f4ab58b6e42a5b26c711',1,'sinh(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f05f7337e5c6b1ee245f37182398e51',1,'sinh(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa641ed89c52fc91f854112ab277934ee',1,'sinh(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5ae3dd563be525b52f9d614b44b0008',1,'sinh(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb23dca771a80de9a2629878d60385e',1,'sinh(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac10c00f0dc12cd8e4eeaad51330251bf',1,'sinh(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e573cff24de567a8d3c8215ec25a686',1,'sinh(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1372528a6d841534331bdd0270d9b87f',1,'sinh(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac5d6219259ed327d126311d05f3f77d',1,'sinh(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8a3df5e8a2b664bec6d194a8efc1b11',1,'sinh(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae30c461aa90a3e7d502737e29898570b',1,'std::sinh()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae30c461aa90a3e7d502737e29898570b',1,'sinh()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af284ce359b6efd4b594a9f8a1f5e5d96',1,'Eigen::sinh()']]], ['sinh_5f_862',['sinh_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5670821e2cf464830fdd577155c97682',1,'cv::cudev::sinh_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5670821e2cf464830fdd577155c97682',1,'sinh_()(Global Namespace)']]], - ['size_863',['size',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0d8ed64f7bbbda6d34e3289681ffdff0',1,'cv::_InputArray::size()'],['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a6f9bc2bcf2fed70c4a6b49f62b7b01bd',1,'cv::ogl::Arrays::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'cv::AutoBuffer::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'AutoBuffer< double, 1 >::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'AutoBuffer< int64, 1 >::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'AutoBuffer< String, 1 >::size()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#af627f6025672dcd3f054667da63f6ae1',1,'cv::ogl::Buffer::size()'],['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a18e35a5bce978c5729ef5ea58b1fee28',1,'cv::DescriptorMatcher::DescriptorCollection::size()'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#addb04c93f4b075a6343d62222f446afc',1,'cv::dnn::DictValue::size()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a05c11e00d20223cde61677de91c71197',1,'cv::FileNode::size()'],['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1flann_1_1GenericIndex.html#affe04ca85a1e20d655ad972ba9b3d72a',1,'cv::flann::GenericIndex::size()'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#aaf653cfda76e2067c792290d509d2fc5',1,'cv::gapi::GKernelPackage::size()'],['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#a111ea435bae91141a418e9ce8f5f31b2',1,'cv::optflow::GPCTrainingSamples::size()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ab02f97698d8272f0d253f3029329ed10',1,'cv::cuda::GpuMat::size()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#aa61acd6d1db2ec950221831dc3fe1ca9',1,'cv::cuda::HostMem::size()'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1tbm_1_1IImageDescriptor.html#a9217032891d76e5e4b1b153af86ec275',1,'cv::tbm::IImageDescriptor::size()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8b5fcf3cec72903e2692e5c71e1c283b',1,'cv::MatExpr::size()'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a80309fab69773987e1c740279b82abd1',1,'cv::MatOp::size()'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#a78d401af8024a6bdacde4886a5538dbe',1,'NCVMatrix::size()'],['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#a202fc148a0ad8df135215ecf1781a0b8',1,'cv::Range::size()'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#ab0c92d80e25e22be48c0110c5200da1e',1,'cv::Rect_::size()'],['https://docs.opencv.org/4.2.0/d5/d34/classcv_1_1tbm_1_1ResizedImageDescriptor.html#a73954a1918519059b34189e3792b4559',1,'cv::tbm::ResizedImageDescriptor::size()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a65eac830987646a4792815ad4e717c3e',1,'cv::SparseMat::size() const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a4fe9c986b3cf0240c68ce985df334c17',1,'cv::SparseMat::size(int i) const'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a65f84b8b7f310fa80d6ca0e1e80be492',1,'cv::ogl::Texture2D::size()'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a57cc6b1a08cb876f8aecc76a4051763c',1,'cv::tbm::Track::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a942b15c04edb2c0c0635d22b50dfa338',1,'__gnu_cxx::__versa_string::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a9bc2a952203a764d5a1cdf80f94bd2a8',1,'__gnu_cxx::temporary_buffer::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'__gnu_debug::basic_string::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< _CharT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< _CharT, _Traits, _Allocator >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< char >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< char, char_traits< char >, _Byte_alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< char_type, _Traits, _Alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< value_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a24d5150e384f657ca3b317ced4dadc5d',1,'deque< _StateSeqT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4b6c305dd92e3c76213778feba213da2',1,'list< __inp, __rebind_inp >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a2ceef4213eb87e16e8fe124fa54a7ea7',1,'match_results< _Bi_iter >::size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a2ceef4213eb87e16e8fe124fa54a7ea7',1,'match_results< _Bi_iter >::size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a625c78a7dc1b563f9754e33879243f4e',1,'stack< _StateSeqT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a9bc2a952203a764d5a1cdf80f94bd2a8',1,'std::_Temporary_buffer::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'std::basic_string::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#acae6b747171db72a7f5b80f698972874',1,'std::bitset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a24d5150e384f657ca3b317ced4dadc5d',1,'std::deque::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaeabfccb9dc90c70b63e73149b026ccf5',1,'std::gslice::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4b6c305dd92e3c76213778feba213da2',1,'std::list::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ab8dd27409135bbee5bb626cd72e0cddb',1,'std::map::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a2ceef4213eb87e16e8fe124fa54a7ea7',1,'std::match_results::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a99416d1336342563c08a44ad664c74a3',1,'std::multimap::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aa0d42b46c75769cbce93494ac80c8c34',1,'std::multiset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#a22575e222bea1d4bdd5e978b2d6c3b04',1,'std::priority_queue::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#a39a435e44d6ff36f98f21dc45a2ac7f0',1,'std::queue::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab21409945167dfbfd999f005739cbc2a',1,'std::set::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5b1a5398fdc4ecf20576f3cae02ea8fc',1,'std::slice::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a625c78a7dc1b563f9754e33879243f4e',1,'std::stack::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aa80249a927b88d3e03afce4993630c17',1,'std::tr2::dynamic_bitset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d1de2c7389176716aceeaba3b1c2bb7',1,'std::unordered_map::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af02efb64c18107a5c4f13a1983cfa5a3',1,'std::unordered_multimap::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#acd836983ff93b793bf5404002ceac468',1,'std::unordered_multiset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a73ec5052e45a7a980d1968a0805a32dd',1,'std::unordered_set::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga351ffb24ad6654f7f5f8b10731fc8c95',1,'std::valarray::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'std::vector::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d1de2c7389176716aceeaba3b1c2bb7',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga351ffb24ad6654f7f5f8b10731fc8c95',1,'valarray< size_t >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< __diff_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _CharClassT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _CharT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _Cmpt >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _Node *, _Nodeptr_Alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _RealType >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _State< _TraitsT::char_type > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _StringT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< block_type, allocator_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< Catalog_info * >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< double >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< int >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< result_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< size_t >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< std::pair< _BiIter, int > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< std::pair< _StateIdT, std::vector > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< std::pair< _StrTransT, _StrTransT > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< sub_match< _Bi_iter >, _Alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< sub_match< _BiIter >, _Alloc >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArithmeticSequence.html#a59c45682aae07a2ce72f7781b420c0d6',1,'Eigen::ArithmeticSequence::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::EigenBase::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< FullPivLU< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< HouseholderQR< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Inverse< PermutationType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< LLT< _MatrixType, _UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PartialPivLU< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PermutationWrapper< _IndicesType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SVDBase< Derived > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Transpose< MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< TriangularView< MatrixType, Mode > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'Eigen::PermutationBase::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< PermutationWrapper< _IndicesType > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'Eigen::SparseMatrixBase::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< Transpose< MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::size()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a33c7c8638bb0b12e6d1b69d8106dd2e0.html#a33c7c8638bb0b12e6d1b69d8106dd2e0',1,'nlohmann::basic_json::size()']]], - ['size_864',['Size',['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#a414d94d96776dd293fadcccc8bb8d945',1,'cv::gapi::own::Size::Size()=default'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#ad47bebdef94e1a54723cd603a0cad05a',1,'cv::gapi::own::Size::Size(int _width, int _height)'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#aa209bef3a32994815d6e6a431f2c4d79',1,'cv::gapi::own::Size::Size(const cv::Size &other)']]], - ['size_865',['size',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5b1a5398fdc4ecf20576f3cae02ea8fc',1,]]], - ['size_5f_866',['Size_',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae09ae11fd75a16928ca40980ad46a9bf',1,'cv::Size_::Size_()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a45c97e9a4930d73fde11c2acc5f371ac',1,'cv::Size_::Size_(_Tp _width, _Tp _height)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#abe760f15bf01a0ee3f51d81f4f8ea259',1,'cv::Size_::Size_(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae220b36673041edafc81c0e9677eb609',1,'cv::Size_::Size_(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2c6d59e6fe58dc2cda78504271b7ec6c',1,'cv::Size_::Size_(const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae09ae11fd75a16928ca40980ad46a9bf',1,'Size_< float >::Size_()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a45c97e9a4930d73fde11c2acc5f371ac',1,'Size_< float >::Size_(float _width, float _height)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#abe760f15bf01a0ee3f51d81f4f8ea259',1,'Size_< float >::Size_(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae220b36673041edafc81c0e9677eb609',1,'Size_< float >::Size_(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2c6d59e6fe58dc2cda78504271b7ec6c',1,'Size_< float >::Size_(const Point_< float > &pt)']]], - ['sizend_867',['sizend',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7cb4cadf3108dc232e05e3ae5550e912',1,'cv::_InputArray']]], - ['sizes_868',['sizes',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a4d0f2228231a351280a1b14b1915fe7b',1,'Eigen::AlignedBox']]], - ['skew_869',['skew',['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga281f0a5a7375c577d33672cb33604718',1,'cv::sfm::skew()'],['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga281f0a5a7375c577d33672cb33604718',1,'skew()(Global Namespace)']]], - ['skipjunk_870',['skipJunk',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ab175c66eb8d1e86abeaa1fc2203e70d5',1,'cv::AVIReadContainer::skipJunk(RiffChunk &chunk)'],['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ad5800e79427105fdb22f9819f83c245b',1,'cv::AVIReadContainer::skipJunk(RiffList &list)']]], - ['skipws_871',['skipws',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad458fa76ad203ae00a0fb1c602ec1cf6',1,'std']]], - ['sleep_5ffor_872',['sleep_for',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01566.html#a7ddb6a2d48e0bb2cace6dd67c4c38596',1,'std::this_thread']]], - ['sleep_5funtil_873',['sleep_until',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01566.html#a277096a2cdd1fc66b7569f457b731bfb',1,'std::this_thread']]], - ['slerp_874',['slerp',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'Eigen::QuaternionBase::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ab9ceb217d03c6a2a6438be37a3ccd855',1,'Eigen::Rotation2D::slerp()']]], - ['slice_875',['slice',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6a83c2410180b69ca38a2da2c4c984b9',1,'std::slice::slice()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9cc9983faafa145460d264127f7fd816',1,'std::slice::slice(size_t __o, size_t __d, size_t __s)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#ae14f6407db835831e8d5b8cc3693b808',1,'cv::dnn::slice(const Mat &m, const _Range &r0)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a72905f90ed70aefb3146201c774e6538',1,'cv::dnn::slice(const Mat &m, const _Range &r0, const _Range &r1)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a40066b7362eb3f88901507fbc44087d7',1,'cv::dnn::slice(const Mat &m, const _Range &r0, const _Range &r1, const _Range &r2)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#ac81609723c58d6db31a2b046a02e3311',1,'cv::dnn::slice(const Mat &m, const _Range &r0, const _Range &r1, const _Range &r2, const _Range &r3)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6a83c2410180b69ca38a2da2c4c984b9',1,'slice()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9cc9983faafa145460d264127f7fd816',1,'slice(size_t __o, size_t __d, size_t __s)(Global Namespace)']]], - ['slice_5farray_876',['slice_array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga886109b8edc60759a1c07ed209bf6110',1,'std::slice_array::slice_array()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga886109b8edc60759a1c07ed209bf6110',1,'slice_array()(Global Namespace)']]], - ['smallestangle_877',['smallestAngle',['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ac648b9217d9f7ba4ee7a1a91aec8e46f',1,'Eigen::Rotation2D']]], - ['smallestpositiveangle_878',['smallestPositiveAngle',['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a09c5195aa9a154551b2edf6ed4f22ab6',1,'Eigen::Rotation2D']]], - ['smallregionremoval_879',['smallRegionRemoval',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a0c4797c9f4efff3dacc87a748bd05038',1,'cv::stereo::Matching']]], - ['smem_5ftuple_880',['smem_tuple',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada9ddc5dd0880d539295fca6c71b1a43',1,'cv::cudev::smem_tuple(T0 *t0)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f5d4d674113e05e6e7634d0e4611d5',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a5947043131d608a3c093795baf5a2',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8498c67667e736f8669853bc01cdc2bf',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb9373e84cb0a13dd14cd4fa4aff4e1',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef4a5236e533195fafad8278b2c5e620',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af9cdcf327bd26e3bf201366508978c',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9438b5a9c4cf14df89be071081f959c',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadae9554fedac7876dee14809422714bc',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee998c9e69107c84770286d11ed10deb',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8, T9 *t9)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada9ddc5dd0880d539295fca6c71b1a43',1,'smem_tuple(T0 *t0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f5d4d674113e05e6e7634d0e4611d5',1,'smem_tuple(T0 *t0, T1 *t1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a5947043131d608a3c093795baf5a2',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8498c67667e736f8669853bc01cdc2bf',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb9373e84cb0a13dd14cd4fa4aff4e1',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef4a5236e533195fafad8278b2c5e620',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af9cdcf327bd26e3bf201366508978c',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9438b5a9c4cf14df89be071081f959c',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadae9554fedac7876dee14809422714bc',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee998c9e69107c84770286d11ed10deb',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8, T9 *t9)(Global Namespace)']]], - ['snextc_881',['snextc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'__gnu_cxx::enc_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'__gnu_cxx::stdio_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'__gnu_cxx::stdio_sync_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_filebuf< char_type, traits_type >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_streambuf< _Elem, _Tr >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_streambuf< char, _Traits >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_streambuf< char, char_traits< char > >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::basic_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::basic_streambuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::basic_stringbuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::wbuffer_convert::snextc()']]], - ['sobel_882',['Sobel',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gacea54f142e81b6758cb6f375ce782c8d',1,'cv::Sobel()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gae1443445c4cb3187dcf439a57cfa534f',1,'cv::gapi::Sobel()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gacea54f142e81b6758cb6f375ce782c8d',1,'Sobel(InputArray src, OutputArray dst, int ddepth, int dx, int dy, int ksize=3, double scale=1, double delta=0, int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gae1443445c4cb3187dcf439a57cfa534f',1,'Sobel(const GMat &src, int ddepth, int dx, int dy, int ksize=3, double scale=1, double delta=0, int borderType=BORDER_DEFAULT, const Scalar &borderValue=Scalar(0))(Global Namespace)']]], - ['sobelx_5f_883',['sobelX_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga945d37fbb4c7155744f8c05da3942cf7',1,'cv::cudev::sobelX_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga945d37fbb4c7155744f8c05da3942cf7',1,'sobelX_()(Global Namespace)']]], - ['sobelxptr_884',['sobelXPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73acbb3438525083fa2fa9d0295243de',1,'cv::cudev::sobelXPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73acbb3438525083fa2fa9d0295243de',1,'sobelXPtr()(Global Namespace)']]], - ['sobelxy_885',['SobelXY',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga675a82fe875fb789e50dc17ab775f59b',1,'cv::gapi::SobelXY()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga675a82fe875fb789e50dc17ab775f59b',1,'SobelXY()(Global Namespace)']]], - ['sobely_5f_886',['sobelY_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga279cba6bb715d130d5f267aa7aa8d8e0',1,'cv::cudev::sobelY_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga279cba6bb715d130d5f267aa7aa8d8e0',1,'sobelY_()(Global Namespace)']]], - ['sobelyptr_887',['sobelYPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e67a64ceb921f54607d12ee7dcdb57',1,'cv::cudev::sobelYPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e67a64ceb921f54607d12ee7dcdb57',1,'sobelYPtr()(Global Namespace)']]], - ['softdouble_888',['softdouble',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaeeadf92dca0d8472616f8608fdcb241e',1,'cv::softdouble::softdouble()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c2434a765a38cafc214c81b54239742',1,'cv::softdouble::softdouble(const softdouble &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga136cdc02508643e0c523b83fe4abd6ca',1,'cv::softdouble::softdouble(const uint32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad6c2c15092e4652a37c32ae066b498aa',1,'cv::softdouble::softdouble(const uint64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga91be418b1b6f40094a8212c5997e680a',1,'cv::softdouble::softdouble(const int32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad2ef086e5378199006e95bab0913cbaf',1,'cv::softdouble::softdouble(const int64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab0ba4201e29886459956de5500d51672',1,'cv::softdouble::softdouble(const double a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaeeadf92dca0d8472616f8608fdcb241e',1,'softdouble()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c2434a765a38cafc214c81b54239742',1,'softdouble(const softdouble &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga136cdc02508643e0c523b83fe4abd6ca',1,'softdouble(const uint32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad6c2c15092e4652a37c32ae066b498aa',1,'softdouble(const uint64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga91be418b1b6f40094a8212c5997e680a',1,'softdouble(const int32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad2ef086e5378199006e95bab0913cbaf',1,'softdouble(const int64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab0ba4201e29886459956de5500d51672',1,'softdouble(const double a)(Global Namespace)']]], - ['softfloat_889',['softfloat',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3bff550288d8719474fe71f463fbfc7f',1,'cv::softfloat::softfloat()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga1a4225942d70d185f9e046d6c863df31',1,'cv::softfloat::softfloat(const softfloat &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga79cdf60b97caf7ba8093f24b8fbbf92c',1,'cv::softfloat::softfloat(const uint32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga16fc78346e0adfbe62a1e6e61939289c',1,'cv::softfloat::softfloat(const uint64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadc3eed39f933f4924ac16a0be93df54c',1,'cv::softfloat::softfloat(const int32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga66426ab441c67a01df01529ccc46521c',1,'cv::softfloat::softfloat(const int64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga04202c2edb5f1f8f75e806fb37abc3b9',1,'cv::softfloat::softfloat(const float a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3bff550288d8719474fe71f463fbfc7f',1,'softfloat()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga1a4225942d70d185f9e046d6c863df31',1,'softfloat(const softfloat &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga79cdf60b97caf7ba8093f24b8fbbf92c',1,'softfloat(const uint32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga16fc78346e0adfbe62a1e6e61939289c',1,'softfloat(const uint64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadc3eed39f933f4924ac16a0be93df54c',1,'softfloat(const int32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga66426ab441c67a01df01529ccc46521c',1,'softfloat(const int64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga04202c2edb5f1f8f75e806fb37abc3b9',1,'softfloat(const float a)(Global Namespace)']]], - ['solve_890',['solve',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'cv::Matx::solve(const Matx< _Tp, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'cv::Matx::solve(const Vec< _Tp, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< _Tp, cn, 1 >::solve(const Matx< _Tp, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< _Tp, cn, 1 >::solve(const Vec< _Tp, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 1, 3 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 1, 3 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 2, 2 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 2, 2 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 2, 3 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 2, 3 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 3, 3 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 3, 3 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 3, 4 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 3, 4 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 4, 4 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 4, 4 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, cn, 1 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, cn, 1 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float, 2, 3 >::solve(const Matx< float, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float, 2, 3 >::solve(const Vec< float, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float, 3, 3 >::solve(const Matx< float, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float, 3, 3 >::solve(const Vec< float, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float, cn, 1 >::solve(const Matx< float, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float, cn, 1 >::solve(const Vec< float, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float_type, 4, 4 >::solve(const Matx< float_type, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float_type, 4, 4 >::solve(const Vec< float_type, m > &rhs, int method) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aaa9c4af89930ab3bb7612ed9ae33d3f5',1,'Eigen::ColPivHouseholderQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aaa9c4af89930ab3bb7612ed9ae33d3f5',1,'ColPivHouseholderQR< MatrixType >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ab303e177cc7df17e435c79dca9ef5654',1,'Eigen::CompleteOrthogonalDecomposition::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a6f1b0a116c78e642e3d2a100a29d1a4a',1,'Eigen::FullPivHouseholderQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#af563471f6f3283fd10779ef02dd0b748',1,'Eigen::FullPivLU::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#a3e8e56769bbaaed0616ad98c4ff99c7b',1,'Eigen::HouseholderQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#aa257dd7a8acf8b347d5a22a13d6ca3e1',1,'Eigen::LDLT::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a3738bb3ce6f9b837a2beb432b937499f',1,'Eigen::LLT::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a49247bd2f742a46bca1f9c2bf1b19ad8',1,'Eigen::PartialPivLU::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'Eigen::SolverBase::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< FullPivLU< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< HouseholderQR< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< LLT< _MatrixType, _UpLo > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< PartialPivLU< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< SVDBase< Derived > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a1a0c8d5e08202f159553ceb01afb07d6',1,'Eigen::SparseLU::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a2892802e7cc880357af770ee02515859',1,'Eigen::SparseQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'Eigen::SparseSolverBase::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'Eigen::SparseSolverBase::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< IncompleteLUT< _Scalar, int > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< IncompleteLUT< _Scalar, int > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< KLU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< KLU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< SuperILU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< SuperILU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< SuperLU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< SuperLU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< UmfPackLU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< UmfPackLU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#ab28499936c0764fe5b56b9f4de701e26',1,'Eigen::SVDBase::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#ab28499936c0764fe5b56b9f4de701e26',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a911664ccf5522c778ffc5405247e8a59',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::solve()'],['../classkinematics_1_1ArmKinematics.html#a34487a1615ea239fba599f86bc3df913',1,'kinematics::ArmKinematics::solve()'],['../classkinematics_1_1InverseArmKinematics.html#a566ec29651bdf0b09fcd5b4bfe2e7d29',1,'kinematics::InverseArmKinematics::solve()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga12b43690dbd31fed96f213eefead2373',1,'cv::solve()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga12b43690dbd31fed96f213eefead2373',1,'solve()(Global Namespace)']]], - ['solvecubic_891',['solveCubic',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1c3b0b925b085b6e96931ee309e6a1da',1,'cv::solveCubic()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1c3b0b925b085b6e96931ee309e6a1da',1,'solveCubic()(Global Namespace)']]], - ['solveinplace_892',['solveInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a43bae99c287250d6092c8f8d1ba90e91',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::solveInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01MatrixType_00_01Mode_00_01Sparse_01_4.html#a3f3385e827fcc0bf27d1ec21c80740bc',1,'Eigen::TriangularViewImpl< MatrixType, Mode, Sparse >::solveInPlace(MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01MatrixType_00_01Mode_00_01Sparse_01_4.html#a70190d4105e1fd4f27abbf73365dfa0c',1,'Eigen::TriangularViewImpl< MatrixType, Mode, Sparse >::solveInPlace(SparseMatrixBase< OtherDerived > &other) const']]], - ['solvelp_893',['solveLP',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#ga9a06d237a9d38ace891efa1ca1b5d00a',1,'cv::solveLP()'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#ga9a06d237a9d38ace891efa1ca1b5d00a',1,'solveLP()(Global Namespace)']]], - ['solvep3p_894',['solveP3P',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gae5af86788e99948d40b39a03f6acf623',1,'cv::solveP3P()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gae5af86788e99948d40b39a03f6acf623',1,'solveP3P()(Global Namespace)']]], - ['solvepnp_895',['solvePnP',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga549c2075fac14829ff4a58bc931c033d',1,'cv::solvePnP()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga549c2075fac14829ff4a58bc931c033d',1,'solvePnP()(Global Namespace)']]], - ['solvepnpgeneric_896',['solvePnPGeneric',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga624af8a6641b9bdb487f63f694e8bb90',1,'cv::solvePnPGeneric()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga624af8a6641b9bdb487f63f694e8bb90',1,'solvePnPGeneric()(Global Namespace)']]], - ['solvepnpransac_897',['solvePnPRansac',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga50620f0e26e02caa2e9adc07b5fbf24e',1,'cv::solvePnPRansac()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga585fcff4132c58f83132e72df5bab179',1,'cv::cuda::solvePnPRansac()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga50620f0e26e02caa2e9adc07b5fbf24e',1,'solvePnPRansac(InputArray objectPoints, InputArray imagePoints, InputArray cameraMatrix, InputArray distCoeffs, OutputArray rvec, OutputArray tvec, bool useExtrinsicGuess=false, int iterationsCount=100, float reprojectionError=8.0, double confidence=0.99, OutputArray inliers=noArray(), int flags=SOLVEPNP_ITERATIVE)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga585fcff4132c58f83132e72df5bab179',1,'solvePnPRansac(const Mat &object, const Mat &image, const Mat &camera_mat, const Mat &dist_coef, Mat &rvec, Mat &tvec, bool use_extrinsic_guess=false, int num_iters=100, float max_dist=8.0, int min_inlier_count=100, std::vector< int > *inliers=NULL)(Global Namespace)']]], - ['solvepnprefinelm_898',['solvePnPRefineLM',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga650ba4d286a96d992f82c3e6dfa525fa',1,'cv::solvePnPRefineLM()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga650ba4d286a96d992f82c3e6dfa525fa',1,'solvePnPRefineLM()(Global Namespace)']]], - ['solvepnprefinevvs_899',['solvePnPRefineVVS',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga17491c0282e4af874f6206a9166774a5',1,'cv::solvePnPRefineVVS()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga17491c0282e4af874f6206a9166774a5',1,'solvePnPRefineVVS()(Global Namespace)']]], - ['solvepoly_900',['solvePoly',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gac2f5e953016fabcdf793d762f4ec5dce',1,'cv::solvePoly()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gac2f5e953016fabcdf793d762f4ec5dce',1,'solvePoly()(Global Namespace)']]], - ['solverbase_901',['SolverBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'Eigen::SolverBase::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< FullPivLU< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< HouseholderQR< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< LLT< _MatrixType, _UpLo > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< PartialPivLU< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< SVDBase< Derived > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::SolverBase()']]], - ['solvewithguess_902',['solveWithGuess',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#adcc18d1ab283786dcbb5a3f63f4b4bd8',1,'Eigen::IterativeSolverBase']]], - ['solvez_903',['solveZ',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#ab255cd24a882ab993fb2f7377ef2774a',1,'cv::SVD']]], - ['sort_904',['sort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a150b5b104440ea65709e70a7f2eba06b',1,'list< __inp, __rebind_inp >::sort()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a96029060c6dd54dc811b3c0d59b06537',1,'list< __inp, __rebind_inp >::sort(_StrictWeakOrdering)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a4bb37711f3350692a1246d7781967ea6',1,'std::forward_list::sort()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a3f59eaf1f58f480eafa906d68d408682',1,'std::forward_list::sort(_Comp __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a150b5b104440ea65709e70a7f2eba06b',1,'std::list::sort()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a96029060c6dd54dc811b3c0d59b06537',1,'std::list::sort(_StrictWeakOrdering)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga45dd56da289494ce874be2324856898f',1,'cv::sort()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga45dd56da289494ce874be2324856898f',1,'sort()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga4ea03048647c50ea7cbdd5da30e82755',1,'std::sort(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gae3c0067ae83db1824367ded659a960b2',1,'std::sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga4ea03048647c50ea7cbdd5da30e82755',1,'sort(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gae3c0067ae83db1824367ded659a960b2',1,'sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['sort_5fheap_905',['sort_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga7e302d6652402edae355b8726b2b7e27',1,'std::sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga441060fda917c1aed4e8fab9c860f706',1,'std::sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga7e302d6652402edae355b8726b2b7e27',1,'sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga441060fda917c1aed4e8fab9c860f706',1,'sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['sortidx_906',['sortIdx',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadf35157cbf97f3cb85a545380e383506',1,'cv::sortIdx()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadf35157cbf97f3cb85a545380e383506',1,'sortIdx()(Global Namespace)']]], - ['source_907',['source',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#aa5ae8887e0dc06f966ba83aaf4102666',1,'cv::ocl::Program::source()'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a456b1a9829e6474696410160b180293a',1,'cv::ocl::ProgramSource::source()']]], - ['sparsecompressedbase_908',['SparseCompressedBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'Eigen::SparseCompressedBase::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Derived >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Transpose< MatrixType > >::SparseCompressedBase()']]], - ['sparsemat_909',['SparseMat',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a9b5f1214a43144122b158c354a93e338',1,'cv::SparseMat::SparseMat()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a62224fe4fbdc6134d80861a150e01b58',1,'cv::SparseMat::SparseMat(int dims, const int *_sizes, int _type)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a753add6192d4355c04e6e3594ab97b49',1,'cv::SparseMat::SparseMat(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af9432a94bda00c7fd2103bcd57654d03',1,'cv::SparseMat::SparseMat(const Mat &m)']]], - ['sparsemat_5f_910',['SparseMat_',['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a359e83f7b4372d439ad31a84e72cd12d',1,'cv::SparseMat_::SparseMat_()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#adb611458d46e670dcaf099f1fceddf9c',1,'cv::SparseMat_::SparseMat_(int dims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ab0e9b029a622c637e17f8288d968f25c',1,'cv::SparseMat_::SparseMat_(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a773ae7065a51b5440d0d9c8b87b7eba3',1,'cv::SparseMat_::SparseMat_(const SparseMat_ &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a0938540b46ceeca038f396f019b1e3c4',1,'cv::SparseMat_::SparseMat_(const Mat &m)']]], - ['sparsematconstiterator_911',['SparseMatConstIterator',['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#af3502cb42a852646d4f8cfed6e3b3c6b',1,'cv::SparseMatConstIterator::SparseMatConstIterator()'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a74e586f5019f8993d34da6dd9eaa74e8',1,'cv::SparseMatConstIterator::SparseMatConstIterator(const SparseMat *_m)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a7549ff275790855409b1da3b14a85ddd',1,'cv::SparseMatConstIterator::SparseMatConstIterator(const SparseMatConstIterator &it)']]], - ['sparsematconstiterator_5f_912',['SparseMatConstIterator_',['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#ae840ff1fdc9aa20eac7953703f42a8ef',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#ac318c1458cb5078b03db72db21ac6de5',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_(const SparseMat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#addc0f436bbbf166ce0ff8a5455ff5009',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_(const SparseMat *_m)'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a5cfedc1a27fb81a75dbd8df905ec83b5',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_(const SparseMatConstIterator_ &it)']]], - ['sparsematiterator_913',['SparseMatIterator',['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a40c1749ef7155fed17b82e2eb233c1d4',1,'cv::SparseMatIterator::SparseMatIterator()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a57bc97f37b1504118bee50c38b2fca2a',1,'cv::SparseMatIterator::SparseMatIterator(SparseMat *_m)'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a302209fba84cdd382c3c0ae7b6e3a064',1,'cv::SparseMatIterator::SparseMatIterator(SparseMat *_m, const int *idx)'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a567658fd3bf0d621f8249b3ddf6140f4',1,'cv::SparseMatIterator::SparseMatIterator(const SparseMatIterator &it)']]], - ['sparsematiterator_5f_914',['SparseMatIterator_',['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a404a0443b24c1139f2c2b914cc468180',1,'cv::SparseMatIterator_::SparseMatIterator_()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#aa07345c1dc666f06d49018130a48aaee',1,'cv::SparseMatIterator_::SparseMatIterator_(SparseMat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a1c965fbfa854ab5bcb0e56ca051fb6c4',1,'cv::SparseMatIterator_::SparseMatIterator_(SparseMat *_m)'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a6d4b4fd6b4f061e0d95f1927130b15d4',1,'cv::SparseMatIterator_::SparseMatIterator_(const SparseMatIterator_ &it)']]], - ['sparsematrix_915',['SparseMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'Eigen::SparseMatrix::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'Eigen::SparseMatrix::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'Eigen::SparseMatrix::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'Eigen::SparseMatrix::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'Eigen::SparseMatrix::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'Eigen::SparseMatrix::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'Eigen::SparseMatrix::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar >::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(Index rows, Index cols)']]], - ['sparseqr_916',['SparseQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a33f76a247183dc50c9c1cbf151288839',1,'Eigen::SparseQR']]], - ['sparsesolverbase_917',['SparseSolverBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'Eigen::SparseSolverBase::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< IncompleteLUT< _Scalar, int > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< KLU< _MatrixType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< SuperILU< _MatrixType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< SuperLU< _MatrixType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< UmfPackLU< _MatrixType > >::SparseSolverBase()']]], - ['sparseview_918',['sparseView',['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'Eigen::MatrixBase::sparseView()'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sparseView()'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'MatrixBase< Solve< Decomposition, RhsType > >::sparseView()'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'sparseView()(Global Namespace)']]], - ['spatialgradient_919',['spatialGradient',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga405d03b20c782b65a4daf54d233239a2',1,'cv::spatialGradient()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga405d03b20c782b65a4daf54d233239a2',1,'spatialGradient()(Global Namespace)']]], - ['specifytype_920',['specifyType',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#a6541ff9f95d789c14807e990dcb55ee9',1,'cv::detail::GArrayU']]], - ['sph_5fbessel_921',['sph_bessel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga478e517ed975bcb256de230e64f0fda5',1,'std::sph_bessel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2bf44b5e5a3b33d518d8a49e06433ece',1,'std::tr1::sph_bessel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga478e517ed975bcb256de230e64f0fda5',1,'sph_bessel(unsigned int __n, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2bf44b5e5a3b33d518d8a49e06433ece',1,'sph_bessel(unsigned int __n, _Tp __x)(Global Namespace)']]], - ['sph_5fbesself_922',['sph_besself',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga534e36e1dcefad8daec98920db16eec4',1,'std::sph_besself()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga534e36e1dcefad8daec98920db16eec4',1,'sph_besself()(Global Namespace)']]], - ['sph_5fbessell_923',['sph_bessell',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga11d72b1af81ce9da3c878a25087ee927',1,'std::sph_bessell()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga11d72b1af81ce9da3c878a25087ee927',1,'sph_bessell()(Global Namespace)']]], - ['sph_5flegendre_924',['sph_legendre',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga573842c12247b87746b548f1945755a8',1,'std::sph_legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga6281837b14f373c4b331509580f66b35',1,'std::tr1::sph_legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga573842c12247b87746b548f1945755a8',1,'sph_legendre(unsigned int __l, unsigned int __m, _Tp __theta)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga6281837b14f373c4b331509580f66b35',1,'sph_legendre(unsigned int __l, unsigned int __m, _Tp __theta)(Global Namespace)']]], - ['sph_5flegendref_925',['sph_legendref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaae635d28c06a3be2679901b382090852',1,'std::sph_legendref()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaae635d28c06a3be2679901b382090852',1,'sph_legendref()(Global Namespace)']]], - ['sph_5flegendrel_926',['sph_legendrel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga2f6618dea1847f09fd67f3c974c1910d',1,'std::sph_legendrel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga2f6618dea1847f09fd67f3c974c1910d',1,'sph_legendrel()(Global Namespace)']]], - ['sph_5fneumann_927',['sph_neumann',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1cf4362a67ab5bae9e6b69c867e85371',1,'std::sph_neumann()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2d353e21ed716e078f26147fb603ed33',1,'std::tr1::sph_neumann()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1cf4362a67ab5bae9e6b69c867e85371',1,'sph_neumann(unsigned int __n, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2d353e21ed716e078f26147fb603ed33',1,'sph_neumann(unsigned int __n, _Tp __x)(Global Namespace)']]], - ['sph_5fneumannf_928',['sph_neumannf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga789143122fa99536329bc2d1b1aac2f0',1,'std::sph_neumannf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga789143122fa99536329bc2d1b1aac2f0',1,'sph_neumannf()(Global Namespace)']]], - ['sph_5fneumannl_929',['sph_neumannl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga3cededa9b6e4601f190c3811e6aabfd6',1,'std::sph_neumannl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga3cededa9b6e4601f190c3811e6aabfd6',1,'sph_neumannl()(Global Namespace)']]], - ['sphericalportraitwarper_930',['SphericalPortraitWarper',['https://docs.opencv.org/4.2.0/d8/d70/classcv_1_1detail_1_1SphericalPortraitWarper.html#a28b73656940563a8b942778e0753d81f',1,'cv::detail::SphericalPortraitWarper']]], - ['sphericalwarper_931',['SphericalWarper',['https://docs.opencv.org/4.2.0/d6/dd0/classcv_1_1detail_1_1SphericalWarper.html#a6d5126785c4821d61c3886523749b8ba',1,'cv::detail::SphericalWarper']]], - ['sphericalwarpergpu_932',['SphericalWarperGpu',['https://docs.opencv.org/4.2.0/db/d09/classcv_1_1detail_1_1SphericalWarperGpu.html#ad89e6054bd99e985c92a602c4e0c44ea',1,'cv::detail::SphericalWarperGpu']]], - ['spin_933',['spin',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a26114066f4d49398fb1b98bde3b5dc78',1,'cv::viz::Viz3d']]], - ['spinonce_934',['spinOnce',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a481d977ad11a63da44ece08e7f76fdef',1,'cv::viz::Viz3d']]], - ['splice_935',['splice',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a2fe50f31cf743a71040ad740b7d1609c',1,'cv::Subdiv2D::splice()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ae27f8110bc96c70775f1654e978b4c5f',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a11428bfeda40f933f26428bf432907db',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &&__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa9275ed20653d145bd3c324e0b0422c3',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa4a9d0e45f35bc5c51ee5b1646304bb6',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &&__x, const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a5e2e8e3c78743063a5223b09a7f7abf6',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &__x, const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ae27f8110bc96c70775f1654e978b4c5f',1,'std::list::splice(const_iterator __position, list &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a11428bfeda40f933f26428bf432907db',1,'std::list::splice(const_iterator __position, list &&__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa9275ed20653d145bd3c324e0b0422c3',1,'std::list::splice(const_iterator __position, list &__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa4a9d0e45f35bc5c51ee5b1646304bb6',1,'std::list::splice(const_iterator __position, list &&__x, const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a5e2e8e3c78743063a5223b09a7f7abf6',1,'std::list::splice(const_iterator __position, list &__x, const_iterator __first, const_iterator __last) noexcept']]], - ['splice_5fafter_936',['splice_after',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a8918bd7e48f28df3b891edfc246556d0',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&__list) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aa3a2a989959206263a683014f575cdc3',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&__list, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a9c1efa0c819d46d9d19f7fc363e14307',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&, const_iterator __before, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac9ba3ce45ccc225252b0a7b14e883dcc',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &, const_iterator __before, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a9c1efa0c819d46d9d19f7fc363e14307',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&, const_iterator __before, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac9ba3ce45ccc225252b0a7b14e883dcc',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &, const_iterator __before, const_iterator __last) noexcept']]], - ['split_937',['Split',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#aa25a57fa40ee868d39b50f4488cac462',1,'cv::ml::DTrees::Split']]], - ['split_938',['split',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0547c7fed86152d7e9d0096029c8518a',1,'cv::split(const Mat &src, Mat *mvbegin)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8027f9deee1e42716be8039e5863fbd9',1,'cv::split(InputArray m, OutputArrayOfArrays mv)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gabe5013d55d4ff586b20393913726179e',1,'cv::cuda::split(InputArray src, GpuMat *dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaf1714e7a9ea0719c29bf378beaf5f99d',1,'cv::cuda::split(InputArray src, std::vector< GpuMat > &dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html#gab5a8449f94bf741fb2b0a4f59ce1c81c',1,'cv::datasets::split()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0547c7fed86152d7e9d0096029c8518a',1,'split(const Mat &src, Mat *mvbegin)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8027f9deee1e42716be8039e5863fbd9',1,'split(InputArray m, OutputArrayOfArrays mv)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gabe5013d55d4ff586b20393913726179e',1,'split(InputArray src, GpuMat *dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaf1714e7a9ea0719c29bf378beaf5f99d',1,'split(InputArray src, std::vector< GpuMat > &dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html#gab5a8449f94bf741fb2b0a4f59ce1c81c',1,'split(const std::string &s, std::vector< std::string > &elems, char delim)(Global Namespace)']]], - ['split16u_939',['split16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8cd402bcaf735ab84d5ad59051868add',1,'cv::hal::split16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8cd402bcaf735ab84d5ad59051868add',1,'split16u()(Global Namespace)']]], - ['split3_940',['split3',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gabfeb794ff284b18121b2b755a5391892',1,'cv::gapi::split3()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gabfeb794ff284b18121b2b755a5391892',1,'split3()(Global Namespace)']]], - ['split32s_941',['split32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfc4896c02badd30b7bba240188c684c',1,'cv::hal::split32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfc4896c02badd30b7bba240188c684c',1,'split32s()(Global Namespace)']]], - ['split4_942',['split4',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gac87c9e2894c8b589eabc0ec2ac9d90eb',1,'cv::gapi::split4()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gac87c9e2894c8b589eabc0ec2ac9d90eb',1,'split4()(Global Namespace)']]], - ['split64s_943',['split64s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac1622b7541f3084a053e12e0419bd88f',1,'cv::hal::split64s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac1622b7541f3084a053e12e0419bd88f',1,'split64s()(Global Namespace)']]], - ['split8u_944',['split8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a989ec41345fcd2e66cc809fa9a4cb4',1,'cv::hal::split8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a989ec41345fcd2e66cc809fa9a4cb4',1,'split8u()(Global Namespace)']]], - ['sputbackc_945',['sputbackc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'__gnu_cxx::enc_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'__gnu_cxx::stdio_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'__gnu_cxx::stdio_sync_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_filebuf< char_type, traits_type >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_streambuf< _Elem, _Tr >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_streambuf< char, _Traits >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_streambuf< char, char_traits< char > >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::basic_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::basic_streambuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::basic_stringbuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::wbuffer_convert::sputbackc()']]], - ['sputc_946',['sputc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'__gnu_cxx::enc_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'__gnu_cxx::stdio_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'__gnu_cxx::stdio_sync_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_filebuf< char_type, traits_type >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_streambuf< _Elem, _Tr >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_streambuf< char, _Traits >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_streambuf< char, char_traits< char > >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::basic_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::basic_streambuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::basic_stringbuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::wbuffer_convert::sputc()']]], - ['sputn_947',['sputn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'__gnu_cxx::enc_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'__gnu_cxx::stdio_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'__gnu_cxx::stdio_sync_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_filebuf< char_type, traits_type >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_streambuf< _Elem, _Tr >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_streambuf< char, _Traits >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_streambuf< char, char_traits< char > >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::basic_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::basic_streambuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::basic_stringbuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::wbuffer_convert::sputn()']]], - ['sqr_948',['sqr',['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1reg_1_1Mapper.html#a8905f76c21eff065d468bb63818f5f20',1,'cv::reg::Mapper::sqr()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga8aae233da90ce0ffe309ab8004342acb',1,'cv::cuda::sqr()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga8aae233da90ce0ffe309ab8004342acb',1,'sqr()(Global Namespace)']]], - ['sqr_5f_949',['sqr_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb27ca55e895037b8a5f57d3f6b83fb9',1,'cv::cudev::sqr_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb27ca55e895037b8a5f57d3f6b83fb9',1,'sqr_()(Global Namespace)']]], - ['sqrboxfilter_950',['sqrBoxFilter',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga76e863e7869912edbe88321253b72688',1,'cv::sqrBoxFilter()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga76e863e7869912edbe88321253b72688',1,'sqrBoxFilter()(Global Namespace)']]], - ['sqrintegral_951',['sqrIntegral',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga40c75196202706399a60bf6ba7a052ac',1,'cv::cuda::sqrIntegral()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga40c75196202706399a60bf6ba7a052ac',1,'sqrIntegral()(Global Namespace)']]], - ['sqrsum_952',['sqrSum',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga056c804ebf5d2eb9f6f35e3dcb01524c',1,'cv::cuda::sqrSum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga056c804ebf5d2eb9f6f35e3dcb01524c',1,'sqrSum()(Global Namespace)']]], - ['sqrt_953',['sqrt',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad873dca860bd47baeeede8663e161b83',1,'Eigen::MatrixBase::sqrt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad873dca860bd47baeeede8663e161b83',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sqrt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad873dca860bd47baeeede8663e161b83',1,'MatrixBase< Solve< Decomposition, RhsType > >::sqrt()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga682082a1892db64a2856403ec17ba297',1,'cv::sqrt(const softfloat &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga021a8c75426f99035d767a68d258e12a',1,'cv::sqrt(const softdouble &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga186222c3919657890f88df5a1f64a7d7',1,'cv::sqrt(InputArray src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga09303680cb1a5521a922b6d392028d8c',1,'cv::cuda::sqrt()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc50a964cceb2c66902a54c327103421',1,'cv::cudev::sqrt(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e7258a055c96158790a168f7f80a97f',1,'cv::cudev::sqrt(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5636d655b66d1e528679dca9099cd0fa',1,'cv::cudev::sqrt(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb80681acb72738ed818f3f2d46b3fa2',1,'cv::cudev::sqrt(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5004527b61c574319714c7cef27adaf',1,'cv::cudev::sqrt(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga922fe16de9a9337ce89c38529cbf4bc2',1,'cv::cudev::sqrt(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f5651c2f477deab8c9a6a22480b0921',1,'cv::cudev::sqrt(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24082b6cad8f2ce48a688416553d4cee',1,'cv::cudev::sqrt(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa976ce20aaa72db500831bf5f7b07573',1,'cv::cudev::sqrt(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14bd8e08e3ed7e7eb27d443b7f561d99',1,'cv::cudev::sqrt(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37cd9743de393cb069367eb6eacfbd47',1,'cv::cudev::sqrt(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb4bf19688d464f9ca6762dcc5052764',1,'cv::cudev::sqrt(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0a7f7fea0c50ddf540b5e4d2652eb59',1,'cv::cudev::sqrt(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabca1ecf48e0d7efa0ef3a267169af3e9',1,'cv::cudev::sqrt(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546317b5fabb8dba6e03c186b29de6e',1,'cv::cudev::sqrt(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b7b4319ad51d28aa241f421d918a106',1,'cv::cudev::sqrt(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5445817fdef24e8f63fe154b3e0ff1db',1,'cv::cudev::sqrt(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf088d5ce5e1a99b65a2e563a1212985',1,'cv::cudev::sqrt(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bac73eee164c074617d7542a0328dff',1,'cv::cudev::sqrt(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf838bdac0e861508a4706edd78f2ff7e',1,'cv::cudev::sqrt(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf5cd21194f2cbaeaada72747bf04a0',1,'cv::cudev::sqrt(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79b759ff3cc2ae788b7cd28876b8f32f',1,'cv::cudev::sqrt(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c295b136a0161bcffd91a1b872b5e6d',1,'cv::cudev::sqrt(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8915709c6046b1de839b156c6a3e2fbd',1,'cv::cudev::sqrt(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadef80c222abf27a9e99b5dd50b6dd911',1,'cv::cudev::sqrt(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fdf1eb5d63c4bd6c0e9aa3826df4c56',1,'cv::cudev::sqrt(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819167f65c834bcb0aff3c93dbc3c6ff',1,'cv::cudev::sqrt(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dec14a6c836fe321ee6d34e43bcf63',1,'cv::cudev::sqrt(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc7ad959ab6a8987b12e7d5f74549864',1,'cv::cudev::sqrt(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf48bb6b8b4f2ec9160f153e00d413071',1,'cv::cudev::sqrt(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00f30f8a2dd3b6e7b2b423f4c77c5e88',1,'cv::cudev::sqrt(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6893715da72b11485bce57fc081add6',1,'cv::cudev::sqrt(const double3 &a)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaf3880c8feae9027fa91a701a1fd0d3b4',1,'cv::gapi::sqrt()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga186222c3919657890f88df5a1f64a7d7',1,'sqrt(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga682082a1892db64a2856403ec17ba297',1,'sqrt(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga021a8c75426f99035d767a68d258e12a',1,'sqrt(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaf3880c8feae9027fa91a701a1fd0d3b4',1,'sqrt(const GMat &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga09303680cb1a5521a922b6d392028d8c',1,'sqrt(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc50a964cceb2c66902a54c327103421',1,'sqrt(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e7258a055c96158790a168f7f80a97f',1,'sqrt(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5636d655b66d1e528679dca9099cd0fa',1,'sqrt(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb80681acb72738ed818f3f2d46b3fa2',1,'sqrt(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5004527b61c574319714c7cef27adaf',1,'sqrt(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga922fe16de9a9337ce89c38529cbf4bc2',1,'sqrt(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f5651c2f477deab8c9a6a22480b0921',1,'sqrt(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24082b6cad8f2ce48a688416553d4cee',1,'sqrt(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa976ce20aaa72db500831bf5f7b07573',1,'sqrt(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14bd8e08e3ed7e7eb27d443b7f561d99',1,'sqrt(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37cd9743de393cb069367eb6eacfbd47',1,'sqrt(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb4bf19688d464f9ca6762dcc5052764',1,'sqrt(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0a7f7fea0c50ddf540b5e4d2652eb59',1,'sqrt(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabca1ecf48e0d7efa0ef3a267169af3e9',1,'sqrt(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546317b5fabb8dba6e03c186b29de6e',1,'sqrt(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b7b4319ad51d28aa241f421d918a106',1,'sqrt(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5445817fdef24e8f63fe154b3e0ff1db',1,'sqrt(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf088d5ce5e1a99b65a2e563a1212985',1,'sqrt(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bac73eee164c074617d7542a0328dff',1,'sqrt(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf838bdac0e861508a4706edd78f2ff7e',1,'sqrt(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf5cd21194f2cbaeaada72747bf04a0',1,'sqrt(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79b759ff3cc2ae788b7cd28876b8f32f',1,'sqrt(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c295b136a0161bcffd91a1b872b5e6d',1,'sqrt(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8915709c6046b1de839b156c6a3e2fbd',1,'sqrt(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadef80c222abf27a9e99b5dd50b6dd911',1,'sqrt(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fdf1eb5d63c4bd6c0e9aa3826df4c56',1,'sqrt(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819167f65c834bcb0aff3c93dbc3c6ff',1,'sqrt(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dec14a6c836fe321ee6d34e43bcf63',1,'sqrt(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc7ad959ab6a8987b12e7d5f74549864',1,'sqrt(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf48bb6b8b4f2ec9160f153e00d413071',1,'sqrt(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00f30f8a2dd3b6e7b2b423f4c77c5e88',1,'sqrt(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6893715da72b11485bce57fc081add6',1,'sqrt(const double3 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf91cd3409ab242d469bcc1b2d06624c3',1,'std::sqrt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf91cd3409ab242d469bcc1b2d06624c3',1,'sqrt()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af4f536e8ea56702e63088efb3706d1f0',1,'Eigen::sqrt()']]], - ['sqrt32f_954',['sqrt32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga99f1449955e5dd00966f4e37fbf72027',1,'cv::hal::sqrt32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga99f1449955e5dd00966f4e37fbf72027',1,'sqrt32f()(Global Namespace)']]], - ['sqrt64f_955',['sqrt64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2343231151ea0b652a3aa38f0b57b9e1',1,'cv::hal::sqrt64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2343231151ea0b652a3aa38f0b57b9e1',1,'sqrt64f()(Global Namespace)']]], - ['sqrt_5f_956',['sqrt_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa26d03e4b54bae8b41de6946e64583',1,'cv::cudev::sqrt_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa26d03e4b54bae8b41de6946e64583',1,'sqrt_()(Global Namespace)']]], - ['square_957',['square',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af28ef8cae3b37bcf1b47910cd6f20d4c',1,'Eigen']]], - ['squareddistance_958',['squaredDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a5cb6544a7fff4c3571c0a5eb82eec8bb',1,'Eigen::ParametrizedLine']]], - ['squaredexteriordistance_959',['squaredExteriorDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#aa91643da79398e454618ad06b92ff531',1,'Eigen::AlignedBox::squaredExteriorDistance(const AlignedBox &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a845dd8a069c204d15f12aa2702dd9539',1,'Eigen::AlignedBox::squaredExteriorDistance(const MatrixBase< Derived > &p) const']]], - ['squarednorm_960',['squaredNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac8da566526419f9742a6c471bbd87e0a',1,'Eigen::MatrixBase::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac8da566526419f9742a6c471bbd87e0a',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac8da566526419f9742a6c471bbd87e0a',1,'MatrixBase< Solve< Decomposition, RhsType > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'Eigen::QuaternionBase::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'Eigen::VectorwiseOp::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Derived, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Derived, Vertical >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::squaredNorm()']]], - ['stabilizationmotions_961',['stabilizationMotions',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a43591cd4c8e8a8efa749950adc86697c',1,'cv::videostab::InpainterBase::stabilizationMotions()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a24db866bac68dab9e8684a6df9b68638',1,'cv::videostab::WobbleSuppressorBase::stabilizationMotions()']]], - ['stabilize_962',['stabilize',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1videostab_1_1GaussianMotionFilter.html#a0549d542dcf377187cdd00b9c6fd72db',1,'cv::videostab::GaussianMotionFilter::stabilize()'],['https://docs.opencv.org/4.2.0/d0/df6/classcv_1_1videostab_1_1IMotionStabilizer.html#a5a2e7cd903bf6297e6775a60a8bcf641',1,'cv::videostab::IMotionStabilizer::stabilize()'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a84553c7288378145589c97bb5a9125fe',1,'cv::videostab::LpMotionStabilizer::stabilize()'],['https://docs.opencv.org/4.2.0/dd/df4/classcv_1_1videostab_1_1MotionFilterBase.html#a6bcb77ecfd36ed88cc494b953596ce4e',1,'cv::videostab::MotionFilterBase::stabilize(int idx, const std::vector< Mat > &motions, std::pair< int, int > range)=0'],['https://docs.opencv.org/4.2.0/dd/df4/classcv_1_1videostab_1_1MotionFilterBase.html#acbf3a7e9245d79966ba7691bcb67fd11',1,'cv::videostab::MotionFilterBase::stabilize(int size, const std::vector< Mat > &motions, std::pair< int, int > range, Mat *stabilizationMotions) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d9/d76/classcv_1_1videostab_1_1MotionStabilizationPipeline.html#a3f4d3891b05955cd17d213dfcbca9ba1',1,'cv::videostab::MotionStabilizationPipeline::stabilize()']]], - ['stabilizedframes_963',['stabilizedFrames',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#ab485476a24a32bcf7aaae31ce5669cb0',1,'cv::videostab::InpainterBase']]], - ['stabilizeframe_964',['stabilizeFrame',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aff4ee85e72d58fb3eb09c0f5c8a9314c',1,'cv::videostab::StabilizerBase']]], - ['stabilizerbase_965',['StabilizerBase',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aac79382ab3f87247ddc01fe0aa86ea64',1,'cv::videostab::StabilizerBase']]], - ['stable_5fpartition_966',['stable_partition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga4396b91f26c7aaf0ae150a79ebd965b7',1,'std::stable_partition()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga4396b91f26c7aaf0ae150a79ebd965b7',1,'stable_partition()(Global Namespace)']]], - ['stable_5fsort_967',['stable_sort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7d8bb8e52b7b0e80301dcbec17225b4a',1,'std::stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a3ce3aa8ac2297f8290939a7988596d',1,'std::stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7d8bb8e52b7b0e80301dcbec17225b4a',1,'stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a3ce3aa8ac2297f8290939a7988596d',1,'stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['stablenorm_968',['stableNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab84d3e64f855813b1eea4202c0697dc1',1,'Eigen::MatrixBase::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab84d3e64f855813b1eea4202c0697dc1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab84d3e64f855813b1eea4202c0697dc1',1,'MatrixBase< Solve< Decomposition, RhsType > >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'Eigen::VectorwiseOp::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Derived, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Derived, Vertical >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::stableNorm()']]], - ['stablenormalize_969',['stableNormalize',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0b1443fa322615379557ade3399a3c3c',1,'Eigen::MatrixBase::stableNormalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0b1443fa322615379557ade3399a3c3c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::stableNormalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0b1443fa322615379557ade3399a3c3c',1,'MatrixBase< Solve< Decomposition, RhsType > >::stableNormalize()']]], - ['stablenormalized_970',['stableNormalized',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a399dca938633b9f8df5ec4beefeccec0',1,'Eigen::MatrixBase::stableNormalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a399dca938633b9f8df5ec4beefeccec0',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::stableNormalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a399dca938633b9f8df5ec4beefeccec0',1,'MatrixBase< Solve< Decomposition, RhsType > >::stableNormalized()']]], - ['stack_971',['stack',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#ad95ef4166cdb0aa8bae1dcd7ae2839e4',1,'stack< _StateSeqT >::stack()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#ad95ef4166cdb0aa8bae1dcd7ae2839e4',1,'std::stack::stack()']]], - ['standardcollector_972',['StandardCollector',['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#a24e397f05bbfaa973ab519d000e559c6',1,'cv::face::StandardCollector']]], - ['starcensustransform_973',['starCensusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6e3b6dac980497890a61871f3ad90ecb',1,'cv::stereo::starCensusTransform(const cv::Mat &img1, const cv::Mat &img2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2)'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#af1ad2e7309e42a42e92d65e13bb526ff',1,'cv::stereo::starCensusTransform(const cv::Mat &img1, int kernelSize, cv::Mat &dist)']]], - ['starkernelcensus_974',['StarKernelCensus',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1stereo_1_1StarKernelCensus.html#af3ec4d3ebcfc04a3dcbd64c7139f8e23',1,'cv::stereo::StarKernelCensus']]], - ['start_975',['start',['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ac979183ede9856427ea8309a91843eaf',1,'cv::GStreamingCompiled::start()'],['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html#a564bc8b0bebcfc6c96f85fc48643e273',1,'cv::TickMeter::start()'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#a73a454d6769e4007da648d984e3193ce',1,'cv::ocl::Timer::start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5f0b7200c4a68f9b939ae84060439707',1,'std::gslice::start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac5e75a2dd40a49ee555fc35d0eeacc1a',1,'std::slice::start()'],['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html#a87f6bd02c5d093b812c0d4790b2181f3',1,'net::mc::tasks::PowerRepeatTask::start()'],['../classnet_1_1websocket_1_1SingleClientWSServer.html#ae5f4b4ef17fb26725e0c6d52909ec9da',1,'net::websocket::SingleClientWSServer::start()'],['../classutil_1_1AsyncTask.html#abe5a114fae049066657d73ccbdd9f3c3',1,'util::AsyncTask::start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac5e75a2dd40a49ee555fc35d0eeacc1a',1,'start()(Global Namespace)']]], - ['start_5farray_976',['start_array',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a5c53878cf08d463eb4e7ca0270532572.html#a5c53878cf08d463eb4e7ca0270532572',1,'nlohmann::json_sax']]], - ['start_5fobject_977',['start_object',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a0671528b0debb5a348169d61f0382a0f.html#a0671528b0debb5a348169d61f0382a0f',1,'nlohmann::json_sax']]], - ['startloop_978',['startLoop',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gae1ae035082d76c7fb981203a974bd4ba',1,'cv::startLoop()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gae1ae035082d76c7fb981203a974bd4ba',1,'startLoop()(Global Namespace)']]], - ['startwindowthread_979',['startWindowThread',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga2c6ecef4f85d8e5cbefec39c9e82ece0',1,'cv::startWindowThread()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga2c6ecef4f85d8e5cbefec39c9e82ece0',1,'startWindowThread()(Global Namespace)']]], - ['startwriteavi_980',['startWriteAVI',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a96eb46757885d235b924d0e246d66ceb',1,'cv::AVIWriteContainer']]], - ['startwritechunk_981',['startWriteChunk',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a0628cd9ee5dcb6997dd233fc370e171c',1,'cv::AVIWriteContainer']]], - ['startwritestruct_982',['startWriteStruct',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a8bb8183cb82d1b3de9eceb13e44efbae',1,'cv::FileStorage']]], - ['state_983',['state',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a4e97b157edf8205bcc60347a86c9ed86',1,'std::fpos::state(_StateT __st)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#ab0b8ab377a6907428414353bca366234',1,'std::fpos::state() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05907.html#a9d0d2e818e6d6cc0b32e86c984561e6f',1,'std::wbuffer_convert::state()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#abd1382f21442adec3f9935d023017871',1,'std::wstring_convert::state()']]], - ['stateconversionfunction_984',['stateConversionFunction',['https://docs.opencv.org/4.2.0/da/d2b/classcv_1_1tracking_1_1UkfSystemModel.html#a5ab724eda5b79639eddcea6351c612fd',1,'cv::tracking::UkfSystemModel']]], - ['static_5fpointer_5fcast_985',['static_pointer_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6a221c308f0ca0e44b5fffa32a6d4595',1,'std']]], - ['staticsaliencyfinegrained_986',['StaticSaliencyFineGrained',['https://docs.opencv.org/4.2.0/da/dd0/classcv_1_1saliency_1_1StaticSaliencyFineGrained.html#a282bc38fecc2a3d158b38eeadb289a00',1,'cv::saliency::StaticSaliencyFineGrained']]], - ['staticsaliencyspectralresidual_987',['StaticSaliencySpectralResidual',['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#a5d691bad0bad797e0bbc0a0673987f54',1,'cv::saliency::StaticSaliencySpectralResidual']]], - ['stddev_988',['stddev',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a43aa93573bdffbacfde869b5a11bed31',1,'normal_distribution< double >::stddev()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a43aa93573bdffbacfde869b5a11bed31',1,'normal_distribution< result_type >::stddev()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a43aa93573bdffbacfde869b5a11bed31',1,'std::normal_distribution::stddev()']]], - ['stdev_989',['stdev',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1videostab_1_1GaussianMotionFilter.html#ac4150e7d3b37cdb95442e2a633941cb7',1,'cv::videostab::GaussianMotionFilter']]], - ['stdevthresh_990',['stdevThresh',['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1videostab_1_1ConsistentMosaicInpainter.html#acaf556d32a5248757702bd662fa8d901',1,'cv::videostab::ConsistentMosaicInpainter']]], - ['stdio_5ffilebuf_991',['stdio_filebuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#a8b64983961c6d4f32b5021a79ad39447',1,'__gnu_cxx::stdio_filebuf::stdio_filebuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#a777faeb6849444b4663d1cbe543e1ae3',1,'__gnu_cxx::stdio_filebuf::stdio_filebuf(int __fd, std::ios_base::openmode __mode, size_t __size=static_cast< size_t >(BUFSIZ))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#a197c58345703b4c82256fe5c1574273f',1,'__gnu_cxx::stdio_filebuf::stdio_filebuf(std::__c_file *__f, std::ios_base::openmode __mode, size_t __size=static_cast< size_t >(BUFSIZ))']]], - ['stdn_992',['stdn',['../namespaceutil.html#a1b6af13be4df99a79372afcde0448fe4',1,'util']]], - ['step_993',['step',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#aa91e7e76c9247f7192ab70d0c0be4783',1,'cv::_InputArray']]], - ['step1_994',['step1',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a5ead91d096cca20e59ba9af8574187cc',1,'cv::cuda::GpuMat::step1()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ad6ab81d95b0e52444250b136e0da3cfd',1,'cv::cudev::GpuMat_::step1()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ab51be367c23f9976389efd3eccbded97',1,'cv::cuda::HostMem::step1()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a0066c8eee40c1706395b1e57f00e0857',1,'cv::Mat::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'cv::Mat_::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< double >::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< float >::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< uchar >::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< unsigned char >::step1()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a5bcb8141a5651e69ceeabddf18d8ddfb',1,'cv::UMat::step1()']]], - ['stept_995',['stepT',['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a1d9a9d12ecf2297a3d540a1985d6f53a',1,'cv::cudev::GpuMat_::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'cv::Mat_::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< double >::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< float >::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< uchar >::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< unsigned char >::stepT()']]], - ['stereocalibrate_996',['stereoCalibrate',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga91018d80e2a93ade37539f01e6f07de5',1,'cv::stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, InputOutputArray R, InputOutputArray T, OutputArray E, OutputArray F, OutputArray perViewErrors, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga246253dcc6de2e0376c599e7d692303a',1,'cv::stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, OutputArray R, OutputArray T, OutputArray E, OutputArray F, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gadbb3a6ca6429528ef302c784df47949b',1,'cv::fisheye::stereoCalibrate()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga6f1aa828b02e7263394acb5f6821cc84',1,'cv::omnidir::stereoCalibrate()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga91018d80e2a93ade37539f01e6f07de5',1,'stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, InputOutputArray R, InputOutputArray T, OutputArray E, OutputArray F, OutputArray perViewErrors, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga246253dcc6de2e0376c599e7d692303a',1,'stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, OutputArray R, OutputArray T, OutputArray E, OutputArray F, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gadbb3a6ca6429528ef302c784df47949b',1,'stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray K1, InputOutputArray D1, InputOutputArray K2, InputOutputArray D2, Size imageSize, OutputArray R, OutputArray T, int flags=fisheye::CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 100, DBL_EPSILON))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga6f1aa828b02e7263394acb5f6821cc84',1,'stereoCalibrate(InputOutputArrayOfArrays objectPoints, InputOutputArrayOfArrays imagePoints1, InputOutputArrayOfArrays imagePoints2, const Size &imageSize1, const Size &imageSize2, InputOutputArray K1, InputOutputArray xi1, InputOutputArray D1, InputOutputArray K2, InputOutputArray xi2, InputOutputArray D2, OutputArray rvec, OutputArray tvec, OutputArrayOfArrays rvecsL, OutputArrayOfArrays tvecsL, int flags, TermCriteria criteria, OutputArray idx=noArray())(Global Namespace)']]], - ['stereographicwarper_997',['StereographicWarper',['https://docs.opencv.org/4.2.0/d1/d3d/classcv_1_1detail_1_1StereographicWarper.html#ac2af47f4b063b6c3d11c8ec0e54c5787',1,'cv::detail::StereographicWarper']]], - ['stereoreconstruct_998',['stereoReconstruct',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga907c0cb0b0ec8896f1e60510b546e63a',1,'cv::omnidir::stereoReconstruct()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga907c0cb0b0ec8896f1e60510b546e63a',1,'stereoReconstruct()(Global Namespace)']]], - ['stereorectify_999',['stereoRectify',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga617b1685d4059c6040827800e72ad2b6',1,'cv::stereoRectify()'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gac1af58774006689056b0f2ef1db55ecc',1,'cv::fisheye::stereoRectify()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gaf055863d589cb166c23cc26fcaa6ce98',1,'cv::omnidir::stereoRectify()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga617b1685d4059c6040827800e72ad2b6',1,'stereoRectify(InputArray cameraMatrix1, InputArray distCoeffs1, InputArray cameraMatrix2, InputArray distCoeffs2, Size imageSize, InputArray R, InputArray T, OutputArray R1, OutputArray R2, OutputArray P1, OutputArray P2, OutputArray Q, int flags=CALIB_ZERO_DISPARITY, double alpha=-1, Size newImageSize=Size(), Rect *validPixROI1=0, Rect *validPixROI2=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gac1af58774006689056b0f2ef1db55ecc',1,'stereoRectify(InputArray K1, InputArray D1, InputArray K2, InputArray D2, const Size &imageSize, InputArray R, InputArray tvec, OutputArray R1, OutputArray R2, OutputArray P1, OutputArray P2, OutputArray Q, int flags, const Size &newImageSize=Size(), double balance=0.0, double fov_scale=1.0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gaf055863d589cb166c23cc26fcaa6ce98',1,'stereoRectify(InputArray R, InputArray T, OutputArray R1, OutputArray R2)(Global Namespace)']]], - ['stereorectifyuncalibrated_1000',['stereoRectifyUncalibrated',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaadc5b14471ddc004939471339294f052',1,'cv::stereoRectifyUncalibrated()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaadc5b14471ddc004939471339294f052',1,'stereoRectifyUncalibrated()(Global Namespace)']]], - ['stitch_1001',['stitch',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a37ee5bacf229e9d0fb9f97c8f5ed1acd',1,'cv::Stitcher::stitch(InputArrayOfArrays images, OutputArray pano)'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a3156a44286a7065ba9e8802023ad2074',1,'cv::Stitcher::stitch(InputArrayOfArrays images, InputArrayOfArrays masks, OutputArray pano)']]], - ['stitchingloglevel_1002',['stitchingLogLevel',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga7616573f03568a19c14e3333f104b2af',1,'cv::detail::stitchingLogLevel()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga7616573f03568a19c14e3333f104b2af',1,'stitchingLogLevel()(Global Namespace)']]], - ['stop_1003',['stop',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ac4061f2d28cf54e48360c8aa06135f38',1,'cv::DetectionBasedTracker::stop()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ae8629e18974fc551af940062ad85a5a7',1,'cv::GStreamingCompiled::stop()'],['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html#aa6dfbdc68373d10e371bd35f92c7adb3',1,'cv::TickMeter::stop()'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#adf6487aa9d91d2282201b197b9bd41d3',1,'cv::ocl::Timer::stop()'],['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html#a7cdd54fa926ecd170ec4e7c215f50592',1,'net::mc::tasks::PowerRepeatTask::stop()'],['../classnet_1_1websocket_1_1SingleClientWSServer.html#ac6eba89635a679c01f7b6891123c1d80',1,'net::websocket::SingleClientWSServer::stop()'],['../classutil_1_1AsyncTask.html#a349580908c4774c5d99159f5be226f95',1,'util::AsyncTask::stop()']]], - ['stopentityanimation_1004',['stopEntityAnimation',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#af64b09bc3720eccdfdeaf13fcc5c8f27',1,'cv::ovis::WindowScene']]], - ['stoploop_1005',['stopLoop',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gad4783dd50a6844a04ac8cb4fe158fdf3',1,'cv::stopLoop()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gad4783dd50a6844a04ac8cb4fe158fdf3',1,'stopLoop()(Global Namespace)']]], - ['str_1006',['str',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a8659c3a93da87fb8de3ca1fdd6c49bc0',1,'match_results< _Bi_iter >::str(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a8659c3a93da87fb8de3ca1fdd6c49bc0',1,'match_results< _Bi_iter >::str(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02471.html#a8402e3c2b036fbd4c696b2ab70b49681',1,'std::basic_istringstream::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02471.html#a4040d59ec2be579cca6a91fb5595553e',1,'std::basic_istringstream::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02475.html#a5fe89030a53e674de2823d9a8cfec39c',1,'std::basic_ostringstream::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02475.html#a1bfbc5ef2c20f06dfbbe8bf046cffa3a',1,'std::basic_ostringstream::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a710ce01324037dd8787cde291a3608e0',1,'std::basic_stringbuf::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a54d0b95ccabadaa97884f3c54f1943d2',1,'std::basic_stringbuf::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02479.html#a36e49da6993836a79290489fab310077',1,'std::basic_stringstream::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02479.html#a84b6a2da124b5f937c3f5dfa12d70957',1,'std::basic_stringstream::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a8659c3a93da87fb8de3ca1fdd6c49bc0',1,'std::match_results::str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#acf17e2826b47f664e97bcf9be35fd9f2',1,'std::sub_match::str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#acf17e2826b47f664e97bcf9be35fd9f2',1,'sub_match< _Bi_iter >::str()']]], - ['stream_1007',['Stream',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#aa6434e2f5f29bd81406732b39951c246',1,'cv::cuda::Stream::Stream()'],['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a3da3061ab4b0c737fcb092494b54cec8',1,'cv::cuda::Stream::Stream(const Ptr< GpuMat::Allocator > &allocator)']]], - ['stride_1008',['stride',['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#af82410455b282716daa1c06401596c09',1,'NCVMatrix::stride()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8a9378455753dd979d6424bdff021820',1,'std::gslice::stride()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab9ee3d00a3ef2be02ac5895894b66ee7',1,'std::slice::stride()']]], - ['stride_1009',['Stride',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Eigen::Stride::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Eigen::Stride::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Eigen::Stride::Stride(Index outerStride, Index innerStride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Stride< 0, Value >::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Stride< 0, Value >::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Stride< 0, Value >::Stride(Index outerStride, Index innerStride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Stride(Index outerStride, Index innerStride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Stride< Value, 0 >::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Stride< Value, 0 >::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Stride< Value, 0 >::Stride(Index outerStride, Index innerStride)']]], - ['stride_1010',['stride',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab9ee3d00a3ef2be02ac5895894b66ee7',1,]]], - ['string_1011',['string',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae7fa61092f596efa610a7f672885f3d6',1,'cv::FileNode::string()'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a07eab82f6c82d606787eee9ad73d2bda.html#a07eab82f6c82d606787eee9ad73d2bda',1,'nlohmann::json_sax::string()']]], - ['strip_1012',['strip',['https://docs.opencv.org/4.2.0/d3/d44/classcv_1_1GArray.html#a77da79851e07739edb1d3b869b485a1a',1,'cv::GArray::strip()'],['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#aa3e0fd33a9587046335f9eb87e399f67',1,'cv::detail::strip()']]], - ['strongclassifierdirectselection_1013',['StrongClassifierDirectSelection',['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html#afc508b47e213b9a068c535a6da8d935b',1,'cv::StrongClassifierDirectSelection']]], - ['stylization_1014',['stylization',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#gacb0f7324017df153d7b5d095aed53206',1,'cv::stylization()'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#gacb0f7324017df153d7b5d095aed53206',1,'stylization()(Global Namespace)']]], - ['sub_1015',['sub',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gab2a1ac8bdeda1de78ec97f9cd8e9ff0a',1,'cv::gapi::sub()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gab2a1ac8bdeda1de78ec97f9cd8e9ff0a',1,'sub()(Global Namespace)']]], - ['sub16s_1016',['sub16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2168b6368851e50c8c6e5c1b39af2abb',1,'cv::hal::sub16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2168b6368851e50c8c6e5c1b39af2abb',1,'sub16s()(Global Namespace)']]], - ['sub16u_1017',['sub16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38881a1fc619c13b879d08947a4f9038',1,'cv::hal::sub16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38881a1fc619c13b879d08947a4f9038',1,'sub16u()(Global Namespace)']]], - ['sub32f_1018',['sub32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7db1a88cf2010a1a413c8d83d46c8373',1,'cv::hal::sub32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7db1a88cf2010a1a413c8d83d46c8373',1,'sub32f()(Global Namespace)']]], - ['sub32s_1019',['sub32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gad6a86901a206d2c9dd37d693f05eece5',1,'cv::hal::sub32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gad6a86901a206d2c9dd37d693f05eece5',1,'sub32s()(Global Namespace)']]], - ['sub64f_1020',['sub64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabcefa88a20f298b67912d253ed180a5b',1,'cv::hal::sub64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabcefa88a20f298b67912d253ed180a5b',1,'sub64f()(Global Namespace)']]], - ['sub8s_1021',['sub8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a0c3f4922f9b2097b585085eae353dd',1,'cv::hal::sub8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a0c3f4922f9b2097b585085eae353dd',1,'sub8s()(Global Namespace)']]], - ['sub8u_1022',['sub8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66404cf0bb4d0b827efad2c86f0b9139',1,'cv::hal::sub8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66404cf0bb4d0b827efad2c86f0b9139',1,'sub8u()(Global Namespace)']]], - ['subc_1023',['subC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa5979f64bab17bf1717f2842d6c1d53f',1,'cv::gapi::subC()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa5979f64bab17bf1717f2842d6c1d53f',1,'subC()(Global Namespace)']]], - ['subdiagonal_1024',['subDiagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#ac423dbb91157c159bdcb4b5a8371232e',1,'Eigen::Tridiagonalization']]], - ['subdiv2d_1025',['Subdiv2D',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aed58be264a17cdbe712b6a35036d13cb',1,'cv::Subdiv2D::Subdiv2D()'],['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa9ae8faa2f7a78428b115407bfc3df9e',1,'cv::Subdiv2D::Subdiv2D(Rect rect)']]], - ['submatrix_1026',['subMatrix',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a892830aff7387b7fa15298250403c95a',1,'cv::omnidir::internal']]], - ['subrc_1027',['subRC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga755bf791d27f88ab5b4214575bf4c5a8',1,'cv::gapi::subRC()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga755bf791d27f88ab5b4214575bf4c5a8',1,'subRC()(Global Namespace)']]], - ['subspaceproject_1028',['subspaceProject',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a69c7019a344edc5c55799c16a9fc9ada',1,'cv::LDA']]], - ['subspacereconstruct_1029',['subspaceReconstruct',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#acbf9949e7567e23af5f71c29fcef76d4',1,'cv::LDA']]], - ['substr_1030',['substr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab38b3bdb3cf4f19355202b28b8424997',1,'__gnu_cxx::__versa_string::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< _CharT >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< _CharT, _Traits, _Allocator >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< char >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< char, char_traits< char >, _Byte_alloc >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< char_type, _Traits, _Alloc >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< value_type >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'std::basic_string::substr()']]], - ['subtract_1031',['subtract',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#adf3a27e2d042073f2d765522c3f2c870',1,'cv::MatOp::subtract(const MatExpr &expr1, const MatExpr &expr2, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a29ace3bec7c07ca07a159c4c6f058ef1',1,'cv::MatOp::subtract(const Scalar &s, const MatExpr &expr, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa0f00d98b4b5edeaeb7b8333b2de353b',1,'cv::subtract()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga6eab60fc250059e2fda79c5636bd067f',1,'cv::cuda::subtract()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa0f00d98b4b5edeaeb7b8333b2de353b',1,'subtract(InputArray src1, InputArray src2, OutputArray dst, InputArray mask=noArray(), int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga6eab60fc250059e2fda79c5636bd067f',1,'subtract(InputArray src1, InputArray src2, OutputArray dst, InputArray mask=noArray(), int dtype=-1, Stream &stream=Stream::Null())(Global Namespace)']]], - ['subtract_5fwith_5fcarry_5fengine_1032',['subtract_with_carry_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a61f08bb272f27b8cbba12a25aee3c804',1,'std::subtract_with_carry_engine::subtract_with_carry_engine(result_type __sd)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#aeb01e590a5c84d08db8b5678ca774172',1,'std::subtract_with_carry_engine::subtract_with_carry_engine(_Sseq &__q)']]], - ['subtractive_5frng_1033',['subtractive_rng',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html#a4e0180804e5e548805eca04c560571d5',1,'__gnu_cxx::subtractive_rng::subtractive_rng(unsigned int __seed)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html#a8763d20bcd47a2f9acd2da92e39193a8',1,'__gnu_cxx::subtractive_rng::subtractive_rng()']]], - ['subtype_1034',['subtype',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_ac3ca9d09e55342f9588404e1dc2222f0.html#ac3ca9d09e55342f9588404e1dc2222f0',1,'nlohmann::byte_container_with_subtype']]], - ['suffix_1035',['suffix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aae76fe76fdc4f6f729e0a55c8c2d4aa4',1,'match_results< _Bi_iter >::suffix() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aae76fe76fdc4f6f729e0a55c8c2d4aa4',1,'match_results< _Bi_iter >::suffix() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aae76fe76fdc4f6f729e0a55c8c2d4aa4',1,'std::match_results::suffix()']]], - ['sum_1036',['sum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabf296b8981ebb3c123b3ba99e753598f',1,'std::valarray::sum()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabf296b8981ebb3c123b3ba99e753598f',1,'valarray< size_t >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'Eigen::DenseBase::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'DenseBase< ArrayWrapper< ExpressionType > >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'DenseBase< Solve< Decomposition, RhsType > >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'Eigen::SparseMatrix::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar, ColMajor, int >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#af48da9cac4c4d8d06d712f7ca4c81ed9',1,'Eigen::SparseVector::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'Eigen::VectorwiseOp::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Derived, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Derived, Vertical >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::sum()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga716e10a2dd9e228e4d3c95818f106722',1,'cv::sum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga1f582844670199281e8012733b50c582',1,'cv::cuda::sum()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga58d80f9e109fed142b280d673afb795a',1,'cv::gapi::sum()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga716e10a2dd9e228e4d3c95818f106722',1,'sum(InputArray src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga58d80f9e109fed142b280d673afb795a',1,'sum(const GMat &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga1f582844670199281e8012733b50c582',1,'sum(InputArray src, InputArray mask=noArray())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabf296b8981ebb3c123b3ba99e753598f',1,'sum() const(Global Namespace)']]], - ['sum_5f_1037',['sum_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa34154947ab224684ddd1020f9e2fb3c',1,'cv::cudev::sum_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa34154947ab224684ddd1020f9e2fb3c',1,'sum_()(Global Namespace)']]], - ['sungetc_1038',['sungetc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'__gnu_cxx::enc_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'__gnu_cxx::stdio_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'__gnu_cxx::stdio_sync_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_filebuf< char_type, traits_type >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_streambuf< _Elem, _Tr >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_streambuf< char, _Traits >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_streambuf< char, char_traits< char > >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::basic_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::basic_streambuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::basic_stringbuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::wbuffer_convert::sungetc()']]], - ['superresolution_1039',['SuperResolution',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a6b6da407515d5def4552cf513ae9e98a',1,'cv::superres::SuperResolution']]], - ['supportbackend_1040',['supportBackend',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a14017804fd5e8c28807263bbdb415383',1,'cv::dnn::Layer']]], - ['supports_1041',['supports',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a67e89f47a61b1bb016e3b20f644f762e',1,'cv::cuda::DeviceInfo']]], - ['suppress_1042',['suppress',['https://docs.opencv.org/4.2.0/d8/da1/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressor.html#aa829e4bb7e33b11567ec3f040e28a7fc',1,'cv::videostab::MoreAccurateMotionWobbleSuppressor::suppress()'],['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1videostab_1_1NullWobbleSuppressor.html#a73bca4742402ffcc348a9acbfc52d07b',1,'cv::videostab::NullWobbleSuppressor::suppress()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a1c39fa83a31e7c62d80b029b8cc19e80',1,'cv::videostab::WobbleSuppressorBase::suppress()']]], - ['suppress_5funused_5fwarning_1043',['suppress_unused_warning',['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a5f00f5a230b8dc4f63bdd1c8057ace44',1,'cv::util']]], - ['surf_5fcuda_1044',['SURF_CUDA',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#ac6522a440dea4b95807d3a3b3417e6a0',1,'cv::cuda::SURF_CUDA::SURF_CUDA()'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a0f7077b5561a105841be6f1a46a29b6d',1,'cv::cuda::SURF_CUDA::SURF_CUDA(double _hessianThreshold, int _nOctaves=4, int _nOctaveLayers=2, bool _extended=false, float _keypointsRatio=0.01f, bool _upright=false)']]], - ['surfacealignment_1045',['surfaceAlignment',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a125e3c0cbd8c63d07637863dff8b0608',1,'cv::cuda::DeviceInfo']]], - ['svbacksubst_1046',['SVBackSubst',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab4e620e6fc6c8a27bb2be3d50a840c0b',1,'cv::SVBackSubst()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab4e620e6fc6c8a27bb2be3d50a840c0b',1,'SVBackSubst()(Global Namespace)']]], - ['svd_1047',['SVD',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a3830f50d56ac2ff7b979e6f7f8991e36',1,'cv::SVD::SVD()'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a54cb96aef54978a3617cb2a2169b689a',1,'cv::SVD::SVD(InputArray src, int flags=0)']]], - ['svd32f_1048',['SVD32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7e379c106c1228dcdac27bab1fb81c6e',1,'cv::hal::SVD32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7e379c106c1228dcdac27bab1fb81c6e',1,'SVD32f()(Global Namespace)']]], - ['svd64f_1049',['SVD64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae50420ada479a479075a154a9e7fb642',1,'cv::hal::SVD64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae50420ada479a479075a154a9e7fb642',1,'SVD64f()(Global Namespace)']]], - ['svdbase_1050',['SVDBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#abed06fc6f4b743e1f76a7b317539da87',1,'Eigen::SVDBase::SVDBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#abed06fc6f4b743e1f76a7b317539da87',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::SVDBase()']]], - ['svdecomp_1051',['SVDecomp',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab477b5b7b39b370bb03e75b19d2d5109',1,'cv::SVDecomp()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab477b5b7b39b370bb03e75b19d2d5109',1,'SVDecomp()(Global Namespace)']]], - ['swap_1052',['swap',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a7135c058aef51c37884a2b2ae8151631',1,'cv::cuda::GpuMat::swap()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a0e1c66de99997b6fe13959dfb6794f2f',1,'cv::cudev::GpuMat_::swap()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a6eabc73d59936b87292125e17415b053',1,'cv::cuda::HostMem::swap()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#ac084b122b402d3c64976e0ccad57ddaf',1,'cv::util::optional::swap()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ac7471fa2590350e45b30cb72da0f7668',1,'cv::util::variant::swap()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ac7471fa2590350e45b30cb72da0f7668',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a05eed1a275b62f425fe4843edb708956',1,'__gnu_cxx::__versa_string::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'__gnu_debug::basic_string::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11783.html#a3a1a56d0954c344eb4db26dce4b84562',1,'__gnu_pbds::sample_probe_fn::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11787.html#a7a6dee2c024c6c77e605c9814e5979cb',1,'__gnu_pbds::sample_range_hashing::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11791.html#a72bbcd1a06b6196c03a35a880ba6ed72',1,'__gnu_pbds::sample_ranged_hash_fn::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#ae0e145612d3056d7186fffcacce2c85d',1,'__gnu_pbds::sample_resize_policy::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a822549474a8d6f889f3aa0abf99656ce',1,'__gnu_pbds::sample_resize_trigger::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12015.html#a48c1b41db4e557029b119c8c5d6002f8',1,'__gnu_pbds::sample_size_policy::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#ad866a56fdeeed727b04774acdc78ab1e',1,'__gnu_pbds::sample_update_policy::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< _CharT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< _CharT, _Traits, _Allocator >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< char >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< char, char_traits< char >, _Byte_alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< char_type, _Traits, _Alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< value_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a41f78615b6896d0b85bef3aea0e41f2f',1,'deque< _StateSeqT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#afca54335268365fbe964394a8fe5df1b',1,'list< __inp, __rebind_inp >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a104e0215b1b9709a9a3cef3280078ded',1,'match_results< _Bi_iter >::swap(match_results &__that) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'match_results< _Bi_iter >::swap(vector &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a104e0215b1b9709a9a3cef3280078ded',1,'match_results< _Bi_iter >::swap(match_results &__that) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a5cd0631c180f408fe3aa42a384bbaa74',1,'std::basic_regex::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'std::basic_string::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a41f78615b6896d0b85bef3aea0e41f2f',1,'std::deque::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a767521afed6c6768073fdef22d2ed292',1,'std::experimental::fundamentals_v1::any::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a3c41eb7aabcd13c334d38bc68afe2cd8',1,'std::forward_list::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#ad6e98060b15f59120e426a787febf1a5',1,'std::function< _Res(_ArgTypes...)>::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#afca54335268365fbe964394a8fe5df1b',1,'std::list::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a6ab3829e42e61a94d9039fea4c07b62f',1,'std::map::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'std::match_results::swap(vector &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a104e0215b1b9709a9a3cef3280078ded',1,'std::match_results::swap(match_results &__that) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a65f198a3e5054fc993d8519127c7b314',1,'std::multimap::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a42f6bb9c9951b84e1876e29cd3b4b607',1,'std::multiset::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2ad1ef1062ee331c848605434d1d5ef6',1,'std::set::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a2029b19ff5945268a03a130ee05e7e75',1,'std::tr2::dynamic_bitset::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'std::unique_ptr::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a6516afbc423bf1f13c37c3c0324fa0f9',1,'std::unique_ptr< _Tp[], _Dp >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae06bac0d1fbee8603ec2ac806950b1ba',1,'std::unordered_map::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac8d3f27e1315796ddcc9b55378f90ce7',1,'std::unordered_multimap::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a87b28725f19b4afc7e58d052bf07be2f',1,'std::unordered_multiset::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a688f24d7010519e2bfa001db6fe180e7',1,'std::unordered_set::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6033c5c6f21fed896e5ff6a06bba62b9',1,'std::valarray::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'std::vector::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Codecvt >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Res_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Result< _Res > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Result_base >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< bool[]>::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae06bac0d1fbee8603ec2ac806950b1ba',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6033c5c6f21fed896e5ff6a06bba62b9',1,'valarray< size_t >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< __diff_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _CharClassT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _CharT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _Cmpt >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _Node *, _Nodeptr_Alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _RealType >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _State< _TraitsT::char_type > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _StringT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< block_type, allocator_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< Catalog_info * >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< double >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< int >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< result_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< size_t >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< std::pair< _BiIter, int > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< std::pair< _StateIdT, std::vector > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< std::pair< _StrTransT, _StrTransT > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< sub_match< _Bi_iter >, _Alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< sub_match< _BiIter >, _Alloc >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'Eigen::DenseBase::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'Eigen::DenseBase::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'DenseBase< ArrayWrapper< ExpressionType > >::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'DenseBase< ArrayWrapper< ExpressionType > >::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'DenseBase< Solve< Decomposition, RhsType > >::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'DenseBase< Solve< Decomposition, RhsType > >::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'Eigen::SparseMatrix::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar, ColMajor, int >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#af0902c911efcf6f162022175b3efd12b',1,'Eigen::SparseVector::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a0c1ece2f97341c7c7e698d67343421a5',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::swap(MatrixBase< OtherDerived > const &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a4e16e0824796bfa218cc91da98fe05b1',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::swap(TriangularBase< OtherDerived > &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a94295a06e0e7b3867fe83afbee4cb202.html#a94295a06e0e7b3867fe83afbee4cb202',1,'nlohmann::basic_json::swap(reference other) noexcept(std::is_nothrow_move_constructible< value_t >::value &&std::is_nothrow_move_assignable< value_t >::value &&std::is_nothrow_move_constructible< json_value >::value &&std::is_nothrow_move_assignable< json_value >::value)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a76126242de262f6d38cadda19e0d13e1.html#a76126242de262f6d38cadda19e0d13e1',1,'nlohmann::basic_json::swap(array_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a57b86bdcfc55557dacc36969adb0417e.html#a57b86bdcfc55557dacc36969adb0417e',1,'nlohmann::basic_json::swap(object_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aac916df9561daf4eaf2372119fe91899.html#aac916df9561daf4eaf2372119fe91899',1,'nlohmann::basic_json::swap(string_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa242e339ebc7583e114f2167a83f8c90.html#aa242e339ebc7583e114f2167a83f8c90',1,'nlohmann::basic_json::swap(binary_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a749a1f5091a5e63ccfe919e0aef986af.html#a749a1f5091a5e63ccfe919e0aef986af',1,'nlohmann::basic_json::swap(typename binary_t::container_type &other)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gafbc8f513f40dc1b7c2d48ea6a5a81776',1,'cv::swap(Mat &a, Mat &b)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaac41913cb7239fd2771b3c3f25349fe0',1,'cv::swap(UMat &a, UMat &b)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gafbc8f513f40dc1b7c2d48ea6a5a81776',1,'swap(Mat &a, Mat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaac41913cb7239fd2771b3c3f25349fe0',1,'swap(UMat &a, UMat &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ac29506dd75ee99d6a88ade595233c6f8',1,'__gnu_cxx::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9d75305041fc556b922d4b3bd2667742',1,'std::swap(pair< _T1, _T2 > &__x, pair< _T1, _T2 > &__y) noexcept(noexcept(__x.swap(__y)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4d5a9efe4608a61cb6c74ddda7f8728f',1,'std::swap(function< _Res(_Args...)> &__x, function< _Res(_Args...)> &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga8cdf0d24423573721c4bdb9b2ffd8a7d',1,'std::swap(basic_regex< _Ch_type, _Rx_traits > &__lhs, basic_regex< _Ch_type, _Rx_traits > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a87939e8186f838ff337074e945c78b6d',1,'std::swap(basic_stringbuf< _CharT, _Traits, _Allocator > &__x, basic_stringbuf< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4dedd893b6faf3eb2e6c6aa0ca0f2e32',1,'std::swap(basic_istringstream< _CharT, _Traits, _Allocator > &__x, basic_istringstream< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab7f8e65ad7deb2a81c9178499d71731a',1,'std::swap(basic_ostringstream< _CharT, _Traits, _Allocator > &__x, basic_ostringstream< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a85a913837de066af6c23b0f4f28e02a0',1,'std::swap(basic_stringstream< _CharT, _Traits, _Allocator > &__x, basic_stringstream< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4007a6b034645ec64b2d436df27a03ec',1,'std::swap(multiset< _Key, _Compare, _Alloc > &__x, multiset< _Key, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9bbb29387dfd4bfad2ef30fb555f649a',1,'std::swap(set< _Key, _Compare, _Alloc > &__x, set< _Key, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae448a7aacea236579e3f239c9448482f',1,'std::swap(multimap< _Key, _Tp, _Compare, _Alloc > &__x, multimap< _Key, _Tp, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab99dc85cd3551cb410655b02a56e5c15',1,'std::swap(basic_filebuf< _CharT, _Traits > &__x, basic_filebuf< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acfe891185fde2307f6e8909338c7b862',1,'std::swap(basic_ifstream< _CharT, _Traits > &__x, basic_ifstream< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4965e732ce5d02e4304dd82bc86e365a',1,'std::swap(basic_ofstream< _CharT, _Traits > &__x, basic_ofstream< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7ccd229f5faee26395b8ee1715576cf0',1,'std::swap(basic_fstream< _CharT, _Traits > &__x, basic_fstream< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aeb866eb47db586b6058b597e97d8b909',1,'std::swap(forward_list< _Tp, _Alloc > &__lx, forward_list< _Tp, _Alloc > &__ly) noexcept(noexcept(__lx.swap(__ly)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a520781978c7299c8f0e206542178d09c',1,'std::swap(map< _Key, _Tp, _Compare, _Alloc > &__x, map< _Key, _Tp, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga2700089f8b9371e6aafdb9a7e7a552e7',1,'std::swap(packaged_task< _Res(_ArgTypes...)> &__x, packaged_task< _Res(_ArgTypes...)> &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga77f74f34f378f6d6b5b987ab9a684c2d',1,'std::swap(tuple< _Elements... > &__x, tuple< _Elements... > &__y) noexcept(noexcept(__x.swap(__y)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a89a3a6f9c11a9ade523d0be6e5b3a190',1,'std::swap(vector< _Tp, _Alloc > &__x, vector< _Tp, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e4c5e4d115e26e6d2e4adf552d9a90',1,'std::swap(match_results< _Bi_iter, _Alloc > &__lhs, match_results< _Bi_iter, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a335bd8d8bfd13a75e2e5c34552ec3daf',1,'std::swap(list< _Tp, _Alloc > &__x, list< _Tp, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7e6765b86dfe7f33455aec5b8a7f7e2e',1,'std::swap(deque< _Tp, _Alloc > &__x, deque< _Tp, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gafa6fdf3b3bd0b4a333f150d62001e9fc',1,'std::swap(_Tp &__a, _Tp &__b) noexcept(__and_< is_nothrow_move_constructible< _Tp >, is_nothrow_move_assignable< _Tp > >::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga6b5d2a0f9529c41034917992630c6c85',1,'std::swap(_Tp(&__a)[_Nm], _Tp(&__b)[_Nm]) noexcept(__is_nothrow_swappable< _Tp >::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0be9c6cc80dd454ea2212c47538c61c4',1,'std::swap(basic_string< _CharT, _Traits, _Alloc > &__lhs, basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac58580a65df691769770684cc985719d',1,'std::swap(unique_lock< _Mutex > &__x, unique_lock< _Mutex > &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga0d3de8f7ff80877e53d25ca9057e1c0f',1,'std::swap(shared_lock< _Mutex > &__x, shared_lock< _Mutex > &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a9f4d5ac9d6926c4a0e2d97179887cb6c',1,'std::__debug::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a416f44c6d2ed7e920c8bab2362ce8ffb',1,'std::__profile::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga2700089f8b9371e6aafdb9a7e7a552e7',1,'swap(packaged_task< _Res(_ArgTypes...)> &__x, packaged_task< _Res(_ArgTypes...)> &__y) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga0d3de8f7ff80877e53d25ca9057e1c0f',1,'swap(shared_lock< _Mutex > &__x, shared_lock< _Mutex > &__y) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6033c5c6f21fed896e5ff6a06bba62b9',1,'swap(valarray< _Tp > &__v) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga8cdf0d24423573721c4bdb9b2ffd8a7d',1,'swap(basic_regex< _Ch_type, _Rx_traits > &__lhs, basic_regex< _Ch_type, _Rx_traits > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e4c5e4d115e26e6d2e4adf552d9a90',1,'swap(match_results< _Bi_iter, _Alloc > &__lhs, match_results< _Bi_iter, _Alloc > &__rhs) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#ga8007443c4b8291e332ef93b1875440b9',1,'swap(any &__x, any &__y) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9d75305041fc556b922d4b3bd2667742',1,'swap(pair< _T1, _T2 > &__x, pair< _T1, _T2 > &__y) noexcept(noexcept(__x.swap(__y)))(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga77f74f34f378f6d6b5b987ab9a684c2d',1,'swap(tuple< _Elements... > &__x, tuple< _Elements... > &__y) noexcept(noexcept(__x.swap(__y)))(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gafa6fdf3b3bd0b4a333f150d62001e9fc',1,'swap(_Tp &__a, _Tp &__b) noexcept(__and_< is_nothrow_move_constructible< _Tp >, is_nothrow_move_assignable< _Tp > >::value)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga6b5d2a0f9529c41034917992630c6c85',1,'swap(_Tp(&__a)[_Nm], _Tp(&__b)[_Nm]) noexcept(__is_nothrow_swappable< _Tp >::value)(Global Namespace)']]], - ['swap_5franges_1053',['swap_ranges',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gae9603907c05659cb5cfc6ea20be9ae01',1,'std::swap_ranges()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gae9603907c05659cb5cfc6ea20be9ae01',1,'swap_ranges()(Global Namespace)']]], - ['swapchannels_1054',['swapChannels',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga75a29cc4a97cde0d43ea066b01de927e',1,'cv::cuda::swapChannels()'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga75a29cc4a97cde0d43ea066b01de927e',1,'swapChannels()(Global Namespace)']]], - ['swapedges_1055',['swapEdges',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1e1fb5d4dceadb03ac61c678cf1afb7f',1,'cv::Subdiv2D']]], - ['swapendian_1056',['swapEndian',['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html#abe2a117d06ff01ec0ce31782cf2aff52',1,'cv::cnn_3dobj::icoSphere']]], - ['swapfeature_1057',['swapFeature',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a64898258ae7de0da05dc80bc18c29c32',1,'cv::TrackerFeatureHAAR::swapFeature(int source, int target)'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a50d20081386f85b3dabe20caa1d229a8',1,'cv::TrackerFeatureHAAR::swapFeature(int id, CvHaarEvaluator::FeatureHaar &feature)']]], - ['swervedrivekinematics_1058',['SwerveDriveKinematics',['../classkinematics_1_1SwerveDriveKinematics.html#aacea45f4e805cb42850ddb1fd7e7533f',1,'kinematics::SwerveDriveKinematics']]], - ['switchtoselectivesearchfast_1059',['switchToSelectiveSearchFast',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a4ea50c9a9df83193dc16f9b74bd95805',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], - ['switchtoselectivesearchquality_1060',['switchToSelectiveSearchQuality',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a4824333bbdd5877e14859298a2ecde12',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], - ['switchtosinglestrategy_1061',['switchToSingleStrategy',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a15995e73a7476442dda5b4210e1e177a',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], - ['symbolvalue_1062',['SymbolValue',['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolValue.html#a2db2a280f108f3253e4f21858a2d14ca',1,'Eigen::symbolic::SymbolValue']]], - ['symedge_1063',['symEdge',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aabbb10b8d5b0311b7e22040fc0db56b4',1,'cv::Subdiv2D']]], - ['symetriccensus_1064',['SymetricCensus',['https://docs.opencv.org/4.2.0/dd/d24/classcv_1_1stereo_1_1SymetricCensus.html#aec7d620a84cd10c722ff58dee97734c4',1,'cv::stereo::SymetricCensus']]], - ['symetriccensustransform_1065',['symetricCensusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a36512a3362c08ac5f26e9c7e7eca1abb',1,'cv::stereo::symetricCensusTransform(const cv::Mat &img1, const cv::Mat &img2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2, const int type)'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a966b36bd327d3da0025d71fa41d361c2',1,'cv::stereo::symetricCensusTransform(const cv::Mat &img1, int kernelSize, cv::Mat &dist1, const int type)']]], - ['sync_1066',['sync',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'__gnu_cxx::enc_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'__gnu_cxx::stdio_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10671.html#aaf870a6b01d27af87ca27c16e601d1df',1,'__gnu_cxx::stdio_sync_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'basic_filebuf< char_type, traits_type >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_iostream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_iostream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char, _Traits >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char, _Traits >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'basic_streambuf< _Elem, _Tr >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'basic_streambuf< char, _Traits >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'basic_streambuf< char, char_traits< char > >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'std::basic_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_fstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_fstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_ifstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_ifstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_iostream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_iostream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'std::basic_streambuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'std::basic_stringbuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_stringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_stringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05907.html#aba9f090cf1273168ea80a024419dab92',1,'std::wbuffer_convert::sync()']]], - ['sync_5fwith_5fstdio_1067',['sync_with_stdio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_ios< char, _Traits >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_iostream< char >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_istream< char >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_istream< char, _Traits >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_ostream< char >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_ostream< char, _Traits >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_fstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ifstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ios::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_iostream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_istream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_istringstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ofstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ostream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ostringstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_stringstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::ios_base::sync_with_stdio()']]], - ['syntheticsequencegenerator_1068',['SyntheticSequenceGenerator',['https://docs.opencv.org/4.2.0/d1/dda/classcv_1_1bgsegm_1_1SyntheticSequenceGenerator.html#a1252da52b70175c097e304334a0723b6',1,'cv::bgsegm::SyntheticSequenceGenerator']]] + ['size_863',['Size',['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#a414d94d96776dd293fadcccc8bb8d945',1,'cv::gapi::own::Size::Size()=default'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#ad47bebdef94e1a54723cd603a0cad05a',1,'cv::gapi::own::Size::Size(int _width, int _height)'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#aa209bef3a32994815d6e6a431f2c4d79',1,'cv::gapi::own::Size::Size(const cv::Size &other)']]], + ['size_864',['size',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0d8ed64f7bbbda6d34e3289681ffdff0',1,'cv::_InputArray::size()'],['https://docs.opencv.org/4.2.0/d6/d53/classcv_1_1ogl_1_1Arrays.html#a6f9bc2bcf2fed70c4a6b49f62b7b01bd',1,'cv::ogl::Arrays::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'cv::AutoBuffer::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'AutoBuffer< double, 1 >::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'AutoBuffer< int64, 1 >::size()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#a3e51a3baa4dcb2d8eaefddc4c3ceb455',1,'AutoBuffer< String, 1 >::size()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#af627f6025672dcd3f054667da63f6ae1',1,'cv::ogl::Buffer::size()'],['https://docs.opencv.org/4.2.0/d4/dac/classcv_1_1DescriptorMatcher_1_1DescriptorCollection.html#a18e35a5bce978c5729ef5ea58b1fee28',1,'cv::DescriptorMatcher::DescriptorCollection::size()'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#addb04c93f4b075a6343d62222f446afc',1,'cv::dnn::DictValue::size()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a05c11e00d20223cde61677de91c71197',1,'cv::FileNode::size()'],['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1flann_1_1GenericIndex.html#affe04ca85a1e20d655ad972ba9b3d72a',1,'cv::flann::GenericIndex::size()'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1gapi_1_1GKernelPackage.html#aaf653cfda76e2067c792290d509d2fc5',1,'cv::gapi::GKernelPackage::size()'],['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#a111ea435bae91141a418e9ce8f5f31b2',1,'cv::optflow::GPCTrainingSamples::size()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ab02f97698d8272f0d253f3029329ed10',1,'cv::cuda::GpuMat::size()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#aa61acd6d1db2ec950221831dc3fe1ca9',1,'cv::cuda::HostMem::size()'],['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1tbm_1_1IImageDescriptor.html#a9217032891d76e5e4b1b153af86ec275',1,'cv::tbm::IImageDescriptor::size()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8b5fcf3cec72903e2692e5c71e1c283b',1,'cv::MatExpr::size()'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a80309fab69773987e1c740279b82abd1',1,'cv::MatOp::size()'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#a78d401af8024a6bdacde4886a5538dbe',1,'NCVMatrix::size()'],['https://docs.opencv.org/4.2.0/da/d35/classcv_1_1Range.html#a202fc148a0ad8df135215ecf1781a0b8',1,'cv::Range::size()'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#ab0c92d80e25e22be48c0110c5200da1e',1,'cv::Rect_::size()'],['https://docs.opencv.org/4.2.0/d5/d34/classcv_1_1tbm_1_1ResizedImageDescriptor.html#a73954a1918519059b34189e3792b4559',1,'cv::tbm::ResizedImageDescriptor::size()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a65eac830987646a4792815ad4e717c3e',1,'cv::SparseMat::size() const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a4fe9c986b3cf0240c68ce985df334c17',1,'cv::SparseMat::size(int i) const'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a65f84b8b7f310fa80d6ca0e1e80be492',1,'cv::ogl::Texture2D::size()'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a57cc6b1a08cb876f8aecc76a4051763c',1,'cv::tbm::Track::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a942b15c04edb2c0c0635d22b50dfa338',1,'__gnu_cxx::__versa_string::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a9bc2a952203a764d5a1cdf80f94bd2a8',1,'__gnu_cxx::temporary_buffer::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'__gnu_debug::basic_string::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< _CharT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< _CharT, _Traits, _Allocator >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< char >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< char, char_traits< char >, _Byte_alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< char_type, _Traits, _Alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'basic_string< value_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a24d5150e384f657ca3b317ced4dadc5d',1,'deque< _StateSeqT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4b6c305dd92e3c76213778feba213da2',1,'list< __inp, __rebind_inp >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a2ceef4213eb87e16e8fe124fa54a7ea7',1,'match_results< _Bi_iter >::size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a2ceef4213eb87e16e8fe124fa54a7ea7',1,'match_results< _Bi_iter >::size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a625c78a7dc1b563f9754e33879243f4e',1,'stack< _StateSeqT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07835.html#a9bc2a952203a764d5a1cdf80f94bd2a8',1,'std::_Temporary_buffer::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a676f896c88073521cfac7aab5f3da5af',1,'std::basic_string::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#acae6b747171db72a7f5b80f698972874',1,'std::bitset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a24d5150e384f657ca3b317ced4dadc5d',1,'std::deque::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaeabfccb9dc90c70b63e73149b026ccf5',1,'std::gslice::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4b6c305dd92e3c76213778feba213da2',1,'std::list::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ab8dd27409135bbee5bb626cd72e0cddb',1,'std::map::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a2ceef4213eb87e16e8fe124fa54a7ea7',1,'std::match_results::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a99416d1336342563c08a44ad664c74a3',1,'std::multimap::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aa0d42b46c75769cbce93494ac80c8c34',1,'std::multiset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07815.html#a22575e222bea1d4bdd5e978b2d6c3b04',1,'std::priority_queue::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#a39a435e44d6ff36f98f21dc45a2ac7f0',1,'std::queue::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ab21409945167dfbfd999f005739cbc2a',1,'std::set::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5b1a5398fdc4ecf20576f3cae02ea8fc',1,'std::slice::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#a625c78a7dc1b563f9754e33879243f4e',1,'std::stack::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aa80249a927b88d3e03afce4993630c17',1,'std::tr2::dynamic_bitset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d1de2c7389176716aceeaba3b1c2bb7',1,'std::unordered_map::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#af02efb64c18107a5c4f13a1983cfa5a3',1,'std::unordered_multimap::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#acd836983ff93b793bf5404002ceac468',1,'std::unordered_multiset::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a73ec5052e45a7a980d1968a0805a32dd',1,'std::unordered_set::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga351ffb24ad6654f7f5f8b10731fc8c95',1,'std::valarray::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'std::vector::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d1de2c7389176716aceeaba3b1c2bb7',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga351ffb24ad6654f7f5f8b10731fc8c95',1,'valarray< size_t >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< __diff_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _CharClassT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _CharT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _Cmpt >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _Node *, _Nodeptr_Alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _RealType >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _State< _TraitsT::char_type > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< _StringT >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< block_type, allocator_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< Catalog_info * >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< double >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< int >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< result_type >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< size_t >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< std::pair< _BiIter, int > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< std::pair< _StateIdT, std::vector > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< std::pair< _StrTransT, _StrTransT > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< sub_match< _Bi_iter >, _Alloc >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#aedc1ee21f6ca2b8304b4f1f430125c8d',1,'vector< sub_match< _BiIter >, _Alloc >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArithmeticSequence.html#a59c45682aae07a2ce72f7781b420c0d6',1,'Eigen::ArithmeticSequence::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'Eigen::EigenBase::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< FullPivLU< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< HouseholderQR< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Inverse< PermutationType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< LLT< _MatrixType, _UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PartialPivLU< _MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< PermutationWrapper< _IndicesType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SVDBase< Derived > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< Transpose< MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::size()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#ae106171b6fefd3f7af108a8283de36c9',1,'EigenBase< TriangularView< MatrixType, Mode > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'Eigen::PermutationBase::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a2216f9ce7b453ac39c46ff0323daeac9',1,'PermutationBase< PermutationWrapper< _IndicesType > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'Eigen::SparseMatrixBase::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< Transpose< MatrixType > >::size()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a124bc57921775eb9aa2dfd9727e23472',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::size()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a33c7c8638bb0b12e6d1b69d8106dd2e0.html#a33c7c8638bb0b12e6d1b69d8106dd2e0',1,'nlohmann::basic_json::size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5b1a5398fdc4ecf20576f3cae02ea8fc',1,'size()(Global Namespace)']]], + ['size_5f_865',['Size_',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae09ae11fd75a16928ca40980ad46a9bf',1,'cv::Size_::Size_()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a45c97e9a4930d73fde11c2acc5f371ac',1,'cv::Size_::Size_(_Tp _width, _Tp _height)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#abe760f15bf01a0ee3f51d81f4f8ea259',1,'cv::Size_::Size_(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae220b36673041edafc81c0e9677eb609',1,'cv::Size_::Size_(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2c6d59e6fe58dc2cda78504271b7ec6c',1,'cv::Size_::Size_(const Point_< _Tp > &pt)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae09ae11fd75a16928ca40980ad46a9bf',1,'Size_< float >::Size_()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a45c97e9a4930d73fde11c2acc5f371ac',1,'Size_< float >::Size_(float _width, float _height)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#abe760f15bf01a0ee3f51d81f4f8ea259',1,'Size_< float >::Size_(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#ae220b36673041edafc81c0e9677eb609',1,'Size_< float >::Size_(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a2c6d59e6fe58dc2cda78504271b7ec6c',1,'Size_< float >::Size_(const Point_< float > &pt)']]], + ['sizend_866',['sizend',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7cb4cadf3108dc232e05e3ae5550e912',1,'cv::_InputArray']]], + ['sizes_867',['sizes',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a4d0f2228231a351280a1b14b1915fe7b',1,'Eigen::AlignedBox']]], + ['skew_868',['skew',['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga281f0a5a7375c577d33672cb33604718',1,'cv::sfm::skew()'],['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga281f0a5a7375c577d33672cb33604718',1,'skew()(Global Namespace)']]], + ['skipjunk_869',['skipJunk',['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ab175c66eb8d1e86abeaa1fc2203e70d5',1,'cv::AVIReadContainer::skipJunk(RiffChunk &chunk)'],['https://docs.opencv.org/4.2.0/d6/d8c/classcv_1_1AVIReadContainer.html#ad5800e79427105fdb22f9819f83c245b',1,'cv::AVIReadContainer::skipJunk(RiffList &list)']]], + ['skipws_870',['skipws',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad458fa76ad203ae00a0fb1c602ec1cf6',1,'std']]], + ['sleep_5ffor_871',['sleep_for',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01566.html#a7ddb6a2d48e0bb2cace6dd67c4c38596',1,'std::this_thread']]], + ['sleep_5funtil_872',['sleep_until',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01566.html#a277096a2cdd1fc66b7569f457b731bfb',1,'std::this_thread']]], + ['slerp_873',['slerp',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'Eigen::QuaternionBase::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ac840bde67d22f2deca330561c65d144e',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::slerp()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ab9ceb217d03c6a2a6438be37a3ccd855',1,'Eigen::Rotation2D::slerp()']]], + ['slice_874',['slice',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6a83c2410180b69ca38a2da2c4c984b9',1,'std::slice::slice()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9cc9983faafa145460d264127f7fd816',1,'std::slice::slice(size_t __o, size_t __d, size_t __s)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#ae14f6407db835831e8d5b8cc3693b808',1,'cv::dnn::slice(const Mat &m, const _Range &r0)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a72905f90ed70aefb3146201c774e6538',1,'cv::dnn::slice(const Mat &m, const _Range &r0, const _Range &r1)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a40066b7362eb3f88901507fbc44087d7',1,'cv::dnn::slice(const Mat &m, const _Range &r0, const _Range &r1, const _Range &r2)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#ac81609723c58d6db31a2b046a02e3311',1,'cv::dnn::slice(const Mat &m, const _Range &r0, const _Range &r1, const _Range &r2, const _Range &r3)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6a83c2410180b69ca38a2da2c4c984b9',1,'slice()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9cc9983faafa145460d264127f7fd816',1,'slice(size_t __o, size_t __d, size_t __s)(Global Namespace)']]], + ['slice_5farray_875',['slice_array',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga886109b8edc60759a1c07ed209bf6110',1,'std::slice_array::slice_array()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga886109b8edc60759a1c07ed209bf6110',1,'slice_array()(Global Namespace)']]], + ['smallestangle_876',['smallestAngle',['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ac648b9217d9f7ba4ee7a1a91aec8e46f',1,'Eigen::Rotation2D']]], + ['smallestpositiveangle_877',['smallestPositiveAngle',['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a09c5195aa9a154551b2edf6ed4f22ab6',1,'Eigen::Rotation2D']]], + ['smallregionremoval_878',['smallRegionRemoval',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a0c4797c9f4efff3dacc87a748bd05038',1,'cv::stereo::Matching']]], + ['smem_5ftuple_879',['smem_tuple',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada9ddc5dd0880d539295fca6c71b1a43',1,'cv::cudev::smem_tuple(T0 *t0)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f5d4d674113e05e6e7634d0e4611d5',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a5947043131d608a3c093795baf5a2',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8498c67667e736f8669853bc01cdc2bf',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb9373e84cb0a13dd14cd4fa4aff4e1',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef4a5236e533195fafad8278b2c5e620',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af9cdcf327bd26e3bf201366508978c',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9438b5a9c4cf14df89be071081f959c',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadae9554fedac7876dee14809422714bc',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee998c9e69107c84770286d11ed10deb',1,'cv::cudev::smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8, T9 *t9)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada9ddc5dd0880d539295fca6c71b1a43',1,'smem_tuple(T0 *t0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f5d4d674113e05e6e7634d0e4611d5',1,'smem_tuple(T0 *t0, T1 *t1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a5947043131d608a3c093795baf5a2',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8498c67667e736f8669853bc01cdc2bf',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fb9373e84cb0a13dd14cd4fa4aff4e1',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef4a5236e533195fafad8278b2c5e620',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af9cdcf327bd26e3bf201366508978c',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9438b5a9c4cf14df89be071081f959c',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadae9554fedac7876dee14809422714bc',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee998c9e69107c84770286d11ed10deb',1,'smem_tuple(T0 *t0, T1 *t1, T2 *t2, T3 *t3, T4 *t4, T5 *t5, T6 *t6, T7 *t7, T8 *t8, T9 *t9)(Global Namespace)']]], + ['snextc_880',['snextc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'__gnu_cxx::enc_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'__gnu_cxx::stdio_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'__gnu_cxx::stdio_sync_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_filebuf< char_type, traits_type >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_streambuf< _Elem, _Tr >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_streambuf< char, _Traits >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'basic_streambuf< char, char_traits< char > >::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::basic_filebuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::basic_streambuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::basic_stringbuf::snextc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a6d281db46069df3043b566f10e5397b2',1,'std::wbuffer_convert::snextc()']]], + ['sobel_881',['Sobel',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gacea54f142e81b6758cb6f375ce782c8d',1,'cv::Sobel()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gae1443445c4cb3187dcf439a57cfa534f',1,'cv::gapi::Sobel()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gacea54f142e81b6758cb6f375ce782c8d',1,'Sobel(InputArray src, OutputArray dst, int ddepth, int dx, int dy, int ksize=3, double scale=1, double delta=0, int borderType=BORDER_DEFAULT)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gae1443445c4cb3187dcf439a57cfa534f',1,'Sobel(const GMat &src, int ddepth, int dx, int dy, int ksize=3, double scale=1, double delta=0, int borderType=BORDER_DEFAULT, const Scalar &borderValue=Scalar(0))(Global Namespace)']]], + ['sobelx_5f_882',['sobelX_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga945d37fbb4c7155744f8c05da3942cf7',1,'cv::cudev::sobelX_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga945d37fbb4c7155744f8c05da3942cf7',1,'sobelX_()(Global Namespace)']]], + ['sobelxptr_883',['sobelXPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73acbb3438525083fa2fa9d0295243de',1,'cv::cudev::sobelXPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73acbb3438525083fa2fa9d0295243de',1,'sobelXPtr()(Global Namespace)']]], + ['sobelxy_884',['SobelXY',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga675a82fe875fb789e50dc17ab775f59b',1,'cv::gapi::SobelXY()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga675a82fe875fb789e50dc17ab775f59b',1,'SobelXY()(Global Namespace)']]], + ['sobely_5f_885',['sobelY_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga279cba6bb715d130d5f267aa7aa8d8e0',1,'cv::cudev::sobelY_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga279cba6bb715d130d5f267aa7aa8d8e0',1,'sobelY_()(Global Namespace)']]], + ['sobelyptr_886',['sobelYPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e67a64ceb921f54607d12ee7dcdb57',1,'cv::cudev::sobelYPtr()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e67a64ceb921f54607d12ee7dcdb57',1,'sobelYPtr()(Global Namespace)']]], + ['softdouble_887',['softdouble',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaeeadf92dca0d8472616f8608fdcb241e',1,'cv::softdouble::softdouble()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c2434a765a38cafc214c81b54239742',1,'cv::softdouble::softdouble(const softdouble &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga136cdc02508643e0c523b83fe4abd6ca',1,'cv::softdouble::softdouble(const uint32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad6c2c15092e4652a37c32ae066b498aa',1,'cv::softdouble::softdouble(const uint64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga91be418b1b6f40094a8212c5997e680a',1,'cv::softdouble::softdouble(const int32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad2ef086e5378199006e95bab0913cbaf',1,'cv::softdouble::softdouble(const int64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab0ba4201e29886459956de5500d51672',1,'cv::softdouble::softdouble(const double a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaeeadf92dca0d8472616f8608fdcb241e',1,'softdouble()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c2434a765a38cafc214c81b54239742',1,'softdouble(const softdouble &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga136cdc02508643e0c523b83fe4abd6ca',1,'softdouble(const uint32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad6c2c15092e4652a37c32ae066b498aa',1,'softdouble(const uint64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga91be418b1b6f40094a8212c5997e680a',1,'softdouble(const int32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gad2ef086e5378199006e95bab0913cbaf',1,'softdouble(const int64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab0ba4201e29886459956de5500d51672',1,'softdouble(const double a)(Global Namespace)']]], + ['softfloat_888',['softfloat',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3bff550288d8719474fe71f463fbfc7f',1,'cv::softfloat::softfloat()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga1a4225942d70d185f9e046d6c863df31',1,'cv::softfloat::softfloat(const softfloat &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga79cdf60b97caf7ba8093f24b8fbbf92c',1,'cv::softfloat::softfloat(const uint32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga16fc78346e0adfbe62a1e6e61939289c',1,'cv::softfloat::softfloat(const uint64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadc3eed39f933f4924ac16a0be93df54c',1,'cv::softfloat::softfloat(const int32_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga66426ab441c67a01df01529ccc46521c',1,'cv::softfloat::softfloat(const int64_t)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga04202c2edb5f1f8f75e806fb37abc3b9',1,'cv::softfloat::softfloat(const float a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3bff550288d8719474fe71f463fbfc7f',1,'softfloat()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga1a4225942d70d185f9e046d6c863df31',1,'softfloat(const softfloat &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga79cdf60b97caf7ba8093f24b8fbbf92c',1,'softfloat(const uint32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga16fc78346e0adfbe62a1e6e61939289c',1,'softfloat(const uint64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadc3eed39f933f4924ac16a0be93df54c',1,'softfloat(const int32_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga66426ab441c67a01df01529ccc46521c',1,'softfloat(const int64_t)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga04202c2edb5f1f8f75e806fb37abc3b9',1,'softfloat(const float a)(Global Namespace)']]], + ['solve_889',['solve',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'cv::Matx::solve(const Matx< _Tp, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'cv::Matx::solve(const Vec< _Tp, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< _Tp, cn, 1 >::solve(const Matx< _Tp, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< _Tp, cn, 1 >::solve(const Vec< _Tp, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 1, 3 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 1, 3 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 2, 2 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 2, 2 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 2, 3 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 2, 3 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 3, 3 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 3, 3 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 3, 4 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 3, 4 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, 4, 4 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, 4, 4 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< double, cn, 1 >::solve(const Matx< double, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< double, cn, 1 >::solve(const Vec< double, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float, 2, 3 >::solve(const Matx< float, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float, 2, 3 >::solve(const Vec< float, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float, 3, 3 >::solve(const Matx< float, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float, 3, 3 >::solve(const Vec< float, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float, cn, 1 >::solve(const Matx< float, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float, cn, 1 >::solve(const Vec< float, m > &rhs, int method) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a94c7233acc9a0431c3908f3b99b482c1',1,'Matx< float_type, 4, 4 >::solve(const Matx< float_type, m, l > &rhs, int flags=DECOMP_LU) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a897c4b796831e77328ad9577184e9cfa',1,'Matx< float_type, 4, 4 >::solve(const Vec< float_type, m > &rhs, int method) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aaa9c4af89930ab3bb7612ed9ae33d3f5',1,'Eigen::ColPivHouseholderQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aaa9c4af89930ab3bb7612ed9ae33d3f5',1,'ColPivHouseholderQR< MatrixType >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ab303e177cc7df17e435c79dca9ef5654',1,'Eigen::CompleteOrthogonalDecomposition::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a6f1b0a116c78e642e3d2a100a29d1a4a',1,'Eigen::FullPivHouseholderQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#af563471f6f3283fd10779ef02dd0b748',1,'Eigen::FullPivLU::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#a3e8e56769bbaaed0616ad98c4ff99c7b',1,'Eigen::HouseholderQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#aa257dd7a8acf8b347d5a22a13d6ca3e1',1,'Eigen::LDLT::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a3738bb3ce6f9b837a2beb432b937499f',1,'Eigen::LLT::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a49247bd2f742a46bca1f9c2bf1b19ad8',1,'Eigen::PartialPivLU::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'Eigen::SolverBase::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< FullPivLU< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< HouseholderQR< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< LLT< _MatrixType, _UpLo > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< PartialPivLU< _MatrixType > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< SVDBase< Derived > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a7fd647d110487799205df6f99547879d',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a1a0c8d5e08202f159553ceb01afb07d6',1,'Eigen::SparseLU::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a2892802e7cc880357af770ee02515859',1,'Eigen::SparseQR::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'Eigen::SparseSolverBase::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'Eigen::SparseSolverBase::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< IncompleteLUT< _Scalar, int > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< IncompleteLUT< _Scalar, int > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< KLU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< KLU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< SuperILU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< SuperILU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< SuperLU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< SuperLU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a4a66e9498b06e3ec4ec36f06b26d4e8f',1,'SparseSolverBase< UmfPackLU< _MatrixType > >::solve(const MatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#a3a8d97173b6e2630f484589b3471cfc7',1,'SparseSolverBase< UmfPackLU< _MatrixType > >::solve(const SparseMatrixBase< Rhs > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#ab28499936c0764fe5b56b9f4de701e26',1,'Eigen::SVDBase::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#ab28499936c0764fe5b56b9f4de701e26',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::solve()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a911664ccf5522c778ffc5405247e8a59',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::solve()'],['../classkinematics_1_1ArmKinematics.html#a34487a1615ea239fba599f86bc3df913',1,'kinematics::ArmKinematics::solve()'],['../classkinematics_1_1InverseArmKinematics.html#a566ec29651bdf0b09fcd5b4bfe2e7d29',1,'kinematics::InverseArmKinematics::solve()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga12b43690dbd31fed96f213eefead2373',1,'cv::solve()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga12b43690dbd31fed96f213eefead2373',1,'solve()(Global Namespace)']]], + ['solvecubic_890',['solveCubic',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1c3b0b925b085b6e96931ee309e6a1da',1,'cv::solveCubic()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga1c3b0b925b085b6e96931ee309e6a1da',1,'solveCubic()(Global Namespace)']]], + ['solveinplace_891',['solveInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a43bae99c287250d6092c8f8d1ba90e91',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::solveInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01MatrixType_00_01Mode_00_01Sparse_01_4.html#a3f3385e827fcc0bf27d1ec21c80740bc',1,'Eigen::TriangularViewImpl< MatrixType, Mode, Sparse >::solveInPlace(MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01MatrixType_00_01Mode_00_01Sparse_01_4.html#a70190d4105e1fd4f27abbf73365dfa0c',1,'Eigen::TriangularViewImpl< MatrixType, Mode, Sparse >::solveInPlace(SparseMatrixBase< OtherDerived > &other) const']]], + ['solvelp_892',['solveLP',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#ga9a06d237a9d38ace891efa1ca1b5d00a',1,'cv::solveLP()'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html#ga9a06d237a9d38ace891efa1ca1b5d00a',1,'solveLP()(Global Namespace)']]], + ['solvep3p_893',['solveP3P',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gae5af86788e99948d40b39a03f6acf623',1,'cv::solveP3P()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gae5af86788e99948d40b39a03f6acf623',1,'solveP3P()(Global Namespace)']]], + ['solvepnp_894',['solvePnP',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga549c2075fac14829ff4a58bc931c033d',1,'cv::solvePnP()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga549c2075fac14829ff4a58bc931c033d',1,'solvePnP()(Global Namespace)']]], + ['solvepnpgeneric_895',['solvePnPGeneric',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga624af8a6641b9bdb487f63f694e8bb90',1,'cv::solvePnPGeneric()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga624af8a6641b9bdb487f63f694e8bb90',1,'solvePnPGeneric()(Global Namespace)']]], + ['solvepnpransac_896',['solvePnPRansac',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga50620f0e26e02caa2e9adc07b5fbf24e',1,'cv::solvePnPRansac()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga585fcff4132c58f83132e72df5bab179',1,'cv::cuda::solvePnPRansac()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga50620f0e26e02caa2e9adc07b5fbf24e',1,'solvePnPRansac(InputArray objectPoints, InputArray imagePoints, InputArray cameraMatrix, InputArray distCoeffs, OutputArray rvec, OutputArray tvec, bool useExtrinsicGuess=false, int iterationsCount=100, float reprojectionError=8.0, double confidence=0.99, OutputArray inliers=noArray(), int flags=SOLVEPNP_ITERATIVE)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga585fcff4132c58f83132e72df5bab179',1,'solvePnPRansac(const Mat &object, const Mat &image, const Mat &camera_mat, const Mat &dist_coef, Mat &rvec, Mat &tvec, bool use_extrinsic_guess=false, int num_iters=100, float max_dist=8.0, int min_inlier_count=100, std::vector< int > *inliers=NULL)(Global Namespace)']]], + ['solvepnprefinelm_897',['solvePnPRefineLM',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga650ba4d286a96d992f82c3e6dfa525fa',1,'cv::solvePnPRefineLM()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga650ba4d286a96d992f82c3e6dfa525fa',1,'solvePnPRefineLM()(Global Namespace)']]], + ['solvepnprefinevvs_898',['solvePnPRefineVVS',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga17491c0282e4af874f6206a9166774a5',1,'cv::solvePnPRefineVVS()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga17491c0282e4af874f6206a9166774a5',1,'solvePnPRefineVVS()(Global Namespace)']]], + ['solvepoly_899',['solvePoly',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gac2f5e953016fabcdf793d762f4ec5dce',1,'cv::solvePoly()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gac2f5e953016fabcdf793d762f4ec5dce',1,'solvePoly()(Global Namespace)']]], + ['solverbase_900',['SolverBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'Eigen::SolverBase::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< FullPivLU< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< HouseholderQR< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< LLT< _MatrixType, _UpLo > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< PartialPivLU< _MatrixType > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< SVDBase< Derived > >::SolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a4d5e5baddfba3790ab1a5f247dcc4dc1',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::SolverBase()']]], + ['solvewithguess_901',['solveWithGuess',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#adcc18d1ab283786dcbb5a3f63f4b4bd8',1,'Eigen::IterativeSolverBase']]], + ['solvez_902',['solveZ',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#ab255cd24a882ab993fb2f7377ef2774a',1,'cv::SVD']]], + ['sort_903',['sort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a150b5b104440ea65709e70a7f2eba06b',1,'list< __inp, __rebind_inp >::sort()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a96029060c6dd54dc811b3c0d59b06537',1,'list< __inp, __rebind_inp >::sort(_StrictWeakOrdering)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a4bb37711f3350692a1246d7781967ea6',1,'std::forward_list::sort()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a3f59eaf1f58f480eafa906d68d408682',1,'std::forward_list::sort(_Comp __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a150b5b104440ea65709e70a7f2eba06b',1,'std::list::sort()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a96029060c6dd54dc811b3c0d59b06537',1,'std::list::sort(_StrictWeakOrdering)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga45dd56da289494ce874be2324856898f',1,'cv::sort()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga45dd56da289494ce874be2324856898f',1,'sort()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga4ea03048647c50ea7cbdd5da30e82755',1,'std::sort(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gae3c0067ae83db1824367ded659a960b2',1,'std::sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga4ea03048647c50ea7cbdd5da30e82755',1,'sort(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gae3c0067ae83db1824367ded659a960b2',1,'sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], + ['sort_5fheap_904',['sort_heap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga7e302d6652402edae355b8726b2b7e27',1,'std::sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga441060fda917c1aed4e8fab9c860f706',1,'std::sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga7e302d6652402edae355b8726b2b7e27',1,'sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01512.html#ga441060fda917c1aed4e8fab9c860f706',1,'sort_heap(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], + ['sortidx_905',['sortIdx',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadf35157cbf97f3cb85a545380e383506',1,'cv::sortIdx()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadf35157cbf97f3cb85a545380e383506',1,'sortIdx()(Global Namespace)']]], + ['source_906',['source',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#aa5ae8887e0dc06f966ba83aaf4102666',1,'cv::ocl::Program::source()'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a456b1a9829e6474696410160b180293a',1,'cv::ocl::ProgramSource::source()']]], + ['sparsecompressedbase_907',['SparseCompressedBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'Eigen::SparseCompressedBase::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Derived >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::SparseCompressedBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a4d6bf2cb53121f653f4212e45922a830',1,'SparseCompressedBase< Transpose< MatrixType > >::SparseCompressedBase()']]], + ['sparsemat_908',['SparseMat',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a9b5f1214a43144122b158c354a93e338',1,'cv::SparseMat::SparseMat()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a62224fe4fbdc6134d80861a150e01b58',1,'cv::SparseMat::SparseMat(int dims, const int *_sizes, int _type)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a753add6192d4355c04e6e3594ab97b49',1,'cv::SparseMat::SparseMat(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af9432a94bda00c7fd2103bcd57654d03',1,'cv::SparseMat::SparseMat(const Mat &m)']]], + ['sparsemat_5f_909',['SparseMat_',['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a359e83f7b4372d439ad31a84e72cd12d',1,'cv::SparseMat_::SparseMat_()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#adb611458d46e670dcaf099f1fceddf9c',1,'cv::SparseMat_::SparseMat_(int dims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ab0e9b029a622c637e17f8288d968f25c',1,'cv::SparseMat_::SparseMat_(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a773ae7065a51b5440d0d9c8b87b7eba3',1,'cv::SparseMat_::SparseMat_(const SparseMat_ &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a0938540b46ceeca038f396f019b1e3c4',1,'cv::SparseMat_::SparseMat_(const Mat &m)']]], + ['sparsematconstiterator_910',['SparseMatConstIterator',['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#af3502cb42a852646d4f8cfed6e3b3c6b',1,'cv::SparseMatConstIterator::SparseMatConstIterator()'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a74e586f5019f8993d34da6dd9eaa74e8',1,'cv::SparseMatConstIterator::SparseMatConstIterator(const SparseMat *_m)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a7549ff275790855409b1da3b14a85ddd',1,'cv::SparseMatConstIterator::SparseMatConstIterator(const SparseMatConstIterator &it)']]], + ['sparsematconstiterator_5f_911',['SparseMatConstIterator_',['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#ae840ff1fdc9aa20eac7953703f42a8ef',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#ac318c1458cb5078b03db72db21ac6de5',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_(const SparseMat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#addc0f436bbbf166ce0ff8a5455ff5009',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_(const SparseMat *_m)'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a5cfedc1a27fb81a75dbd8df905ec83b5',1,'cv::SparseMatConstIterator_::SparseMatConstIterator_(const SparseMatConstIterator_ &it)']]], + ['sparsematiterator_912',['SparseMatIterator',['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a40c1749ef7155fed17b82e2eb233c1d4',1,'cv::SparseMatIterator::SparseMatIterator()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a57bc97f37b1504118bee50c38b2fca2a',1,'cv::SparseMatIterator::SparseMatIterator(SparseMat *_m)'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a302209fba84cdd382c3c0ae7b6e3a064',1,'cv::SparseMatIterator::SparseMatIterator(SparseMat *_m, const int *idx)'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a567658fd3bf0d621f8249b3ddf6140f4',1,'cv::SparseMatIterator::SparseMatIterator(const SparseMatIterator &it)']]], + ['sparsematiterator_5f_913',['SparseMatIterator_',['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a404a0443b24c1139f2c2b914cc468180',1,'cv::SparseMatIterator_::SparseMatIterator_()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#aa07345c1dc666f06d49018130a48aaee',1,'cv::SparseMatIterator_::SparseMatIterator_(SparseMat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a1c965fbfa854ab5bcb0e56ca051fb6c4',1,'cv::SparseMatIterator_::SparseMatIterator_(SparseMat *_m)'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a6d4b4fd6b4f061e0d95f1927130b15d4',1,'cv::SparseMatIterator_::SparseMatIterator_(const SparseMatIterator_ &it)']]], + ['sparsematrix_914',['SparseMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'Eigen::SparseMatrix::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'Eigen::SparseMatrix::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'Eigen::SparseMatrix::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'Eigen::SparseMatrix::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'Eigen::SparseMatrix::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'Eigen::SparseMatrix::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'Eigen::SparseMatrix::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar >::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar, ColMajor, int >::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::SparseMatrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a68087ee333c9614ea28850ec52069079',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a1c6fde42fd40e6f753b60f71e8fd88aa',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const DiagonalBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e328e4686980219c2b4d2a932670ab0',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const ReturnByValue< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#af0fa64cdba1f30353aac937a31db33f3',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const SparseMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a501a50f0d7d58dc4c1d990cd912f581f',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const SparseMatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa755e8ba4ec4a2e39ebdb658228364e5',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(const SparseSelfAdjointView< OtherDerived, UpLo > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a6abf1015a0243be97648e106a17b01ea',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::SparseMatrix(Index rows, Index cols)']]], + ['sparseqr_915',['SparseQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a33f76a247183dc50c9c1cbf151288839',1,'Eigen::SparseQR']]], + ['sparsesolverbase_916',['SparseSolverBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'Eigen::SparseSolverBase::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodDecomposition< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodSimplicialLDLT< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodSimplicialLLT< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< CholmodSupernodalLLT< _MatrixType, Lower > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< IncompleteCholesky< Scalar, Lower, AMDOrdering< int > > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< IncompleteLUT< _Scalar, int > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< KLU< _MatrixType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< SparseLUTransposeView< Conjugate, SparseLUType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< SuperILU< _MatrixType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< SuperLU< _MatrixType > >::SparseSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSolverBase.html#aacd99fa17db475e74d3834767f392f33',1,'SparseSolverBase< UmfPackLU< _MatrixType > >::SparseSolverBase()']]], + ['sparseview_917',['sparseView',['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'Eigen::MatrixBase::sparseView()'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sparseView()'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'MatrixBase< Solve< Decomposition, RhsType > >::sparseView()'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html#ga320dd291cbf4339c6118c41521b75350',1,'sparseView()(Global Namespace)']]], + ['spatialgradient_918',['spatialGradient',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga405d03b20c782b65a4daf54d233239a2',1,'cv::spatialGradient()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga405d03b20c782b65a4daf54d233239a2',1,'spatialGradient()(Global Namespace)']]], + ['specifytype_919',['specifyType',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1detail_1_1GArrayU.html#a6541ff9f95d789c14807e990dcb55ee9',1,'cv::detail::GArrayU']]], + ['sph_5fbessel_920',['sph_bessel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga478e517ed975bcb256de230e64f0fda5',1,'std::sph_bessel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2bf44b5e5a3b33d518d8a49e06433ece',1,'std::tr1::sph_bessel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga478e517ed975bcb256de230e64f0fda5',1,'sph_bessel(unsigned int __n, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2bf44b5e5a3b33d518d8a49e06433ece',1,'sph_bessel(unsigned int __n, _Tp __x)(Global Namespace)']]], + ['sph_5fbesself_921',['sph_besself',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga534e36e1dcefad8daec98920db16eec4',1,'std::sph_besself()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga534e36e1dcefad8daec98920db16eec4',1,'sph_besself()(Global Namespace)']]], + ['sph_5fbessell_922',['sph_bessell',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga11d72b1af81ce9da3c878a25087ee927',1,'std::sph_bessell()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga11d72b1af81ce9da3c878a25087ee927',1,'sph_bessell()(Global Namespace)']]], + ['sph_5flegendre_923',['sph_legendre',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga573842c12247b87746b548f1945755a8',1,'std::sph_legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga6281837b14f373c4b331509580f66b35',1,'std::tr1::sph_legendre()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga573842c12247b87746b548f1945755a8',1,'sph_legendre(unsigned int __l, unsigned int __m, _Tp __theta)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga6281837b14f373c4b331509580f66b35',1,'sph_legendre(unsigned int __l, unsigned int __m, _Tp __theta)(Global Namespace)']]], + ['sph_5flegendref_924',['sph_legendref',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaae635d28c06a3be2679901b382090852',1,'std::sph_legendref()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#gaae635d28c06a3be2679901b382090852',1,'sph_legendref()(Global Namespace)']]], + ['sph_5flegendrel_925',['sph_legendrel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga2f6618dea1847f09fd67f3c974c1910d',1,'std::sph_legendrel()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga2f6618dea1847f09fd67f3c974c1910d',1,'sph_legendrel()(Global Namespace)']]], + ['sph_5fneumann_926',['sph_neumann',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1cf4362a67ab5bae9e6b69c867e85371',1,'std::sph_neumann()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2d353e21ed716e078f26147fb603ed33',1,'std::tr1::sph_neumann()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1cf4362a67ab5bae9e6b69c867e85371',1,'sph_neumann(unsigned int __n, _Tp __x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html#ga2d353e21ed716e078f26147fb603ed33',1,'sph_neumann(unsigned int __n, _Tp __x)(Global Namespace)']]], + ['sph_5fneumannf_927',['sph_neumannf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga789143122fa99536329bc2d1b1aac2f0',1,'std::sph_neumannf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga789143122fa99536329bc2d1b1aac2f0',1,'sph_neumannf()(Global Namespace)']]], + ['sph_5fneumannl_928',['sph_neumannl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga3cededa9b6e4601f190c3811e6aabfd6',1,'std::sph_neumannl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga3cededa9b6e4601f190c3811e6aabfd6',1,'sph_neumannl()(Global Namespace)']]], + ['sphericalportraitwarper_929',['SphericalPortraitWarper',['https://docs.opencv.org/4.2.0/d8/d70/classcv_1_1detail_1_1SphericalPortraitWarper.html#a28b73656940563a8b942778e0753d81f',1,'cv::detail::SphericalPortraitWarper']]], + ['sphericalwarper_930',['SphericalWarper',['https://docs.opencv.org/4.2.0/d6/dd0/classcv_1_1detail_1_1SphericalWarper.html#a6d5126785c4821d61c3886523749b8ba',1,'cv::detail::SphericalWarper']]], + ['sphericalwarpergpu_931',['SphericalWarperGpu',['https://docs.opencv.org/4.2.0/db/d09/classcv_1_1detail_1_1SphericalWarperGpu.html#ad89e6054bd99e985c92a602c4e0c44ea',1,'cv::detail::SphericalWarperGpu']]], + ['spin_932',['spin',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a26114066f4d49398fb1b98bde3b5dc78',1,'cv::viz::Viz3d']]], + ['spinonce_933',['spinOnce',['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#a481d977ad11a63da44ece08e7f76fdef',1,'cv::viz::Viz3d']]], + ['splice_934',['splice',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a2fe50f31cf743a71040ad740b7d1609c',1,'cv::Subdiv2D::splice()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ae27f8110bc96c70775f1654e978b4c5f',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a11428bfeda40f933f26428bf432907db',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &&__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa9275ed20653d145bd3c324e0b0422c3',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa4a9d0e45f35bc5c51ee5b1646304bb6',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &&__x, const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a5e2e8e3c78743063a5223b09a7f7abf6',1,'list< __inp, __rebind_inp >::splice(const_iterator __position, list &__x, const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ae27f8110bc96c70775f1654e978b4c5f',1,'std::list::splice(const_iterator __position, list &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a11428bfeda40f933f26428bf432907db',1,'std::list::splice(const_iterator __position, list &&__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa9275ed20653d145bd3c324e0b0422c3',1,'std::list::splice(const_iterator __position, list &__x, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aa4a9d0e45f35bc5c51ee5b1646304bb6',1,'std::list::splice(const_iterator __position, list &&__x, const_iterator __first, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a5e2e8e3c78743063a5223b09a7f7abf6',1,'std::list::splice(const_iterator __position, list &__x, const_iterator __first, const_iterator __last) noexcept']]], + ['splice_5fafter_935',['splice_after',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a8918bd7e48f28df3b891edfc246556d0',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&__list) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aa3a2a989959206263a683014f575cdc3',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&__list, const_iterator __i) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a9c1efa0c819d46d9d19f7fc363e14307',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&, const_iterator __before, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac9ba3ce45ccc225252b0a7b14e883dcc',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &, const_iterator __before, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a9c1efa0c819d46d9d19f7fc363e14307',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &&, const_iterator __before, const_iterator __last) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ac9ba3ce45ccc225252b0a7b14e883dcc',1,'std::forward_list::splice_after(const_iterator __pos, forward_list &, const_iterator __before, const_iterator __last) noexcept']]], + ['split_936',['Split',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#aa25a57fa40ee868d39b50f4488cac462',1,'cv::ml::DTrees::Split']]], + ['split_937',['split',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0547c7fed86152d7e9d0096029c8518a',1,'cv::split(const Mat &src, Mat *mvbegin)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8027f9deee1e42716be8039e5863fbd9',1,'cv::split(InputArray m, OutputArrayOfArrays mv)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gabe5013d55d4ff586b20393913726179e',1,'cv::cuda::split(InputArray src, GpuMat *dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaf1714e7a9ea0719c29bf378beaf5f99d',1,'cv::cuda::split(InputArray src, std::vector< GpuMat > &dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html#gab5a8449f94bf741fb2b0a4f59ce1c81c',1,'cv::datasets::split()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0547c7fed86152d7e9d0096029c8518a',1,'split(const Mat &src, Mat *mvbegin)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8027f9deee1e42716be8039e5863fbd9',1,'split(InputArray m, OutputArrayOfArrays mv)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gabe5013d55d4ff586b20393913726179e',1,'split(InputArray src, GpuMat *dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaf1714e7a9ea0719c29bf378beaf5f99d',1,'split(InputArray src, std::vector< GpuMat > &dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html#gab5a8449f94bf741fb2b0a4f59ce1c81c',1,'split(const std::string &s, std::vector< std::string > &elems, char delim)(Global Namespace)']]], + ['split16u_938',['split16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8cd402bcaf735ab84d5ad59051868add',1,'cv::hal::split16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8cd402bcaf735ab84d5ad59051868add',1,'split16u()(Global Namespace)']]], + ['split3_939',['split3',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gabfeb794ff284b18121b2b755a5391892',1,'cv::gapi::split3()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gabfeb794ff284b18121b2b755a5391892',1,'split3()(Global Namespace)']]], + ['split32s_940',['split32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfc4896c02badd30b7bba240188c684c',1,'cv::hal::split32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfc4896c02badd30b7bba240188c684c',1,'split32s()(Global Namespace)']]], + ['split4_941',['split4',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gac87c9e2894c8b589eabc0ec2ac9d90eb',1,'cv::gapi::split4()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gac87c9e2894c8b589eabc0ec2ac9d90eb',1,'split4()(Global Namespace)']]], + ['split64s_942',['split64s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac1622b7541f3084a053e12e0419bd88f',1,'cv::hal::split64s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac1622b7541f3084a053e12e0419bd88f',1,'split64s()(Global Namespace)']]], + ['split8u_943',['split8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a989ec41345fcd2e66cc809fa9a4cb4',1,'cv::hal::split8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a989ec41345fcd2e66cc809fa9a4cb4',1,'split8u()(Global Namespace)']]], + ['sputbackc_944',['sputbackc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'__gnu_cxx::enc_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'__gnu_cxx::stdio_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'__gnu_cxx::stdio_sync_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_filebuf< char_type, traits_type >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_streambuf< _Elem, _Tr >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_streambuf< char, _Traits >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'basic_streambuf< char, char_traits< char > >::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::basic_filebuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::basic_streambuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::basic_stringbuf::sputbackc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#ae77ef8a76529317abdc2e6a66336e3ec',1,'std::wbuffer_convert::sputbackc()']]], + ['sputc_945',['sputc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'__gnu_cxx::enc_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'__gnu_cxx::stdio_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'__gnu_cxx::stdio_sync_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_filebuf< char_type, traits_type >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_streambuf< _Elem, _Tr >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_streambuf< char, _Traits >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'basic_streambuf< char, char_traits< char > >::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::basic_filebuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::basic_streambuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::basic_stringbuf::sputc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#af3504dac5b4cd940dbce97ddc5ed0c25',1,'std::wbuffer_convert::sputc()']]], + ['sputn_946',['sputn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'__gnu_cxx::enc_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'__gnu_cxx::stdio_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'__gnu_cxx::stdio_sync_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_filebuf< char_type, traits_type >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_streambuf< _Elem, _Tr >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_streambuf< char, _Traits >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'basic_streambuf< char, char_traits< char > >::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::basic_filebuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::basic_streambuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::basic_stringbuf::sputn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a5d2917460a0283e7e2ff51940704ca95',1,'std::wbuffer_convert::sputn()']]], + ['sqr_947',['sqr',['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1reg_1_1Mapper.html#a8905f76c21eff065d468bb63818f5f20',1,'cv::reg::Mapper::sqr()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga8aae233da90ce0ffe309ab8004342acb',1,'cv::cuda::sqr()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga8aae233da90ce0ffe309ab8004342acb',1,'sqr()(Global Namespace)']]], + ['sqr_5f_948',['sqr_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb27ca55e895037b8a5f57d3f6b83fb9',1,'cv::cudev::sqr_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb27ca55e895037b8a5f57d3f6b83fb9',1,'sqr_()(Global Namespace)']]], + ['sqrboxfilter_949',['sqrBoxFilter',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga76e863e7869912edbe88321253b72688',1,'cv::sqrBoxFilter()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga76e863e7869912edbe88321253b72688',1,'sqrBoxFilter()(Global Namespace)']]], + ['sqrintegral_950',['sqrIntegral',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga40c75196202706399a60bf6ba7a052ac',1,'cv::cuda::sqrIntegral()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga40c75196202706399a60bf6ba7a052ac',1,'sqrIntegral()(Global Namespace)']]], + ['sqrsum_951',['sqrSum',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga056c804ebf5d2eb9f6f35e3dcb01524c',1,'cv::cuda::sqrSum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga056c804ebf5d2eb9f6f35e3dcb01524c',1,'sqrSum()(Global Namespace)']]], + ['sqrt_952',['sqrt',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad873dca860bd47baeeede8663e161b83',1,'Eigen::MatrixBase::sqrt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad873dca860bd47baeeede8663e161b83',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::sqrt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ad873dca860bd47baeeede8663e161b83',1,'MatrixBase< Solve< Decomposition, RhsType > >::sqrt()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga682082a1892db64a2856403ec17ba297',1,'cv::sqrt(const softfloat &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga021a8c75426f99035d767a68d258e12a',1,'cv::sqrt(const softdouble &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga186222c3919657890f88df5a1f64a7d7',1,'cv::sqrt(InputArray src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga09303680cb1a5521a922b6d392028d8c',1,'cv::cuda::sqrt()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc50a964cceb2c66902a54c327103421',1,'cv::cudev::sqrt(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e7258a055c96158790a168f7f80a97f',1,'cv::cudev::sqrt(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5636d655b66d1e528679dca9099cd0fa',1,'cv::cudev::sqrt(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb80681acb72738ed818f3f2d46b3fa2',1,'cv::cudev::sqrt(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5004527b61c574319714c7cef27adaf',1,'cv::cudev::sqrt(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga922fe16de9a9337ce89c38529cbf4bc2',1,'cv::cudev::sqrt(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f5651c2f477deab8c9a6a22480b0921',1,'cv::cudev::sqrt(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24082b6cad8f2ce48a688416553d4cee',1,'cv::cudev::sqrt(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa976ce20aaa72db500831bf5f7b07573',1,'cv::cudev::sqrt(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14bd8e08e3ed7e7eb27d443b7f561d99',1,'cv::cudev::sqrt(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37cd9743de393cb069367eb6eacfbd47',1,'cv::cudev::sqrt(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb4bf19688d464f9ca6762dcc5052764',1,'cv::cudev::sqrt(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0a7f7fea0c50ddf540b5e4d2652eb59',1,'cv::cudev::sqrt(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabca1ecf48e0d7efa0ef3a267169af3e9',1,'cv::cudev::sqrt(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546317b5fabb8dba6e03c186b29de6e',1,'cv::cudev::sqrt(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b7b4319ad51d28aa241f421d918a106',1,'cv::cudev::sqrt(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5445817fdef24e8f63fe154b3e0ff1db',1,'cv::cudev::sqrt(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf088d5ce5e1a99b65a2e563a1212985',1,'cv::cudev::sqrt(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bac73eee164c074617d7542a0328dff',1,'cv::cudev::sqrt(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf838bdac0e861508a4706edd78f2ff7e',1,'cv::cudev::sqrt(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf5cd21194f2cbaeaada72747bf04a0',1,'cv::cudev::sqrt(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79b759ff3cc2ae788b7cd28876b8f32f',1,'cv::cudev::sqrt(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c295b136a0161bcffd91a1b872b5e6d',1,'cv::cudev::sqrt(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8915709c6046b1de839b156c6a3e2fbd',1,'cv::cudev::sqrt(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadef80c222abf27a9e99b5dd50b6dd911',1,'cv::cudev::sqrt(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fdf1eb5d63c4bd6c0e9aa3826df4c56',1,'cv::cudev::sqrt(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819167f65c834bcb0aff3c93dbc3c6ff',1,'cv::cudev::sqrt(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dec14a6c836fe321ee6d34e43bcf63',1,'cv::cudev::sqrt(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc7ad959ab6a8987b12e7d5f74549864',1,'cv::cudev::sqrt(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf48bb6b8b4f2ec9160f153e00d413071',1,'cv::cudev::sqrt(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00f30f8a2dd3b6e7b2b423f4c77c5e88',1,'cv::cudev::sqrt(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6893715da72b11485bce57fc081add6',1,'cv::cudev::sqrt(const double3 &a)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaf3880c8feae9027fa91a701a1fd0d3b4',1,'cv::gapi::sqrt()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga186222c3919657890f88df5a1f64a7d7',1,'sqrt(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga682082a1892db64a2856403ec17ba297',1,'sqrt(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga021a8c75426f99035d767a68d258e12a',1,'sqrt(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaf3880c8feae9027fa91a701a1fd0d3b4',1,'sqrt(const GMat &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga09303680cb1a5521a922b6d392028d8c',1,'sqrt(InputArray src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc50a964cceb2c66902a54c327103421',1,'sqrt(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e7258a055c96158790a168f7f80a97f',1,'sqrt(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5636d655b66d1e528679dca9099cd0fa',1,'sqrt(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb80681acb72738ed818f3f2d46b3fa2',1,'sqrt(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5004527b61c574319714c7cef27adaf',1,'sqrt(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga922fe16de9a9337ce89c38529cbf4bc2',1,'sqrt(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f5651c2f477deab8c9a6a22480b0921',1,'sqrt(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24082b6cad8f2ce48a688416553d4cee',1,'sqrt(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa976ce20aaa72db500831bf5f7b07573',1,'sqrt(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14bd8e08e3ed7e7eb27d443b7f561d99',1,'sqrt(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37cd9743de393cb069367eb6eacfbd47',1,'sqrt(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb4bf19688d464f9ca6762dcc5052764',1,'sqrt(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0a7f7fea0c50ddf540b5e4d2652eb59',1,'sqrt(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabca1ecf48e0d7efa0ef3a267169af3e9',1,'sqrt(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546317b5fabb8dba6e03c186b29de6e',1,'sqrt(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b7b4319ad51d28aa241f421d918a106',1,'sqrt(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5445817fdef24e8f63fe154b3e0ff1db',1,'sqrt(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf088d5ce5e1a99b65a2e563a1212985',1,'sqrt(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bac73eee164c074617d7542a0328dff',1,'sqrt(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf838bdac0e861508a4706edd78f2ff7e',1,'sqrt(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf5cd21194f2cbaeaada72747bf04a0',1,'sqrt(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79b759ff3cc2ae788b7cd28876b8f32f',1,'sqrt(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c295b136a0161bcffd91a1b872b5e6d',1,'sqrt(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8915709c6046b1de839b156c6a3e2fbd',1,'sqrt(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadef80c222abf27a9e99b5dd50b6dd911',1,'sqrt(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fdf1eb5d63c4bd6c0e9aa3826df4c56',1,'sqrt(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819167f65c834bcb0aff3c93dbc3c6ff',1,'sqrt(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dec14a6c836fe321ee6d34e43bcf63',1,'sqrt(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc7ad959ab6a8987b12e7d5f74549864',1,'sqrt(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf48bb6b8b4f2ec9160f153e00d413071',1,'sqrt(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00f30f8a2dd3b6e7b2b423f4c77c5e88',1,'sqrt(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6893715da72b11485bce57fc081add6',1,'sqrt(const double3 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf91cd3409ab242d469bcc1b2d06624c3',1,'std::sqrt()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf91cd3409ab242d469bcc1b2d06624c3',1,'sqrt()(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af4f536e8ea56702e63088efb3706d1f0',1,'Eigen::sqrt()']]], + ['sqrt32f_953',['sqrt32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga99f1449955e5dd00966f4e37fbf72027',1,'cv::hal::sqrt32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga99f1449955e5dd00966f4e37fbf72027',1,'sqrt32f()(Global Namespace)']]], + ['sqrt64f_954',['sqrt64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2343231151ea0b652a3aa38f0b57b9e1',1,'cv::hal::sqrt64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2343231151ea0b652a3aa38f0b57b9e1',1,'sqrt64f()(Global Namespace)']]], + ['sqrt_5f_955',['sqrt_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa26d03e4b54bae8b41de6946e64583',1,'cv::cudev::sqrt_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa26d03e4b54bae8b41de6946e64583',1,'sqrt_()(Global Namespace)']]], + ['square_956',['square',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#af28ef8cae3b37bcf1b47910cd6f20d4c',1,'Eigen']]], + ['squareddistance_957',['squaredDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a5cb6544a7fff4c3571c0a5eb82eec8bb',1,'Eigen::ParametrizedLine']]], + ['squaredexteriordistance_958',['squaredExteriorDistance',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#aa91643da79398e454618ad06b92ff531',1,'Eigen::AlignedBox::squaredExteriorDistance(const AlignedBox &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a845dd8a069c204d15f12aa2702dd9539',1,'Eigen::AlignedBox::squaredExteriorDistance(const MatrixBase< Derived > &p) const']]], + ['squarednorm_959',['squaredNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac8da566526419f9742a6c471bbd87e0a',1,'Eigen::MatrixBase::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac8da566526419f9742a6c471bbd87e0a',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ac8da566526419f9742a6c471bbd87e0a',1,'MatrixBase< Solve< Decomposition, RhsType > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'Eigen::QuaternionBase::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a09730db4ef0b546f5cf29f6b180b3c87',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'Eigen::VectorwiseOp::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Derived, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Derived, Vertical >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::squaredNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a01474cf971473a73c919f6a99323d4f5',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::squaredNorm()']]], + ['stabilizationmotions_960',['stabilizationMotions',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a43591cd4c8e8a8efa749950adc86697c',1,'cv::videostab::InpainterBase::stabilizationMotions()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a24db866bac68dab9e8684a6df9b68638',1,'cv::videostab::WobbleSuppressorBase::stabilizationMotions()']]], + ['stabilize_961',['stabilize',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1videostab_1_1GaussianMotionFilter.html#a0549d542dcf377187cdd00b9c6fd72db',1,'cv::videostab::GaussianMotionFilter::stabilize()'],['https://docs.opencv.org/4.2.0/d0/df6/classcv_1_1videostab_1_1IMotionStabilizer.html#a5a2e7cd903bf6297e6775a60a8bcf641',1,'cv::videostab::IMotionStabilizer::stabilize()'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a84553c7288378145589c97bb5a9125fe',1,'cv::videostab::LpMotionStabilizer::stabilize()'],['https://docs.opencv.org/4.2.0/dd/df4/classcv_1_1videostab_1_1MotionFilterBase.html#a6bcb77ecfd36ed88cc494b953596ce4e',1,'cv::videostab::MotionFilterBase::stabilize(int idx, const std::vector< Mat > &motions, std::pair< int, int > range)=0'],['https://docs.opencv.org/4.2.0/dd/df4/classcv_1_1videostab_1_1MotionFilterBase.html#acbf3a7e9245d79966ba7691bcb67fd11',1,'cv::videostab::MotionFilterBase::stabilize(int size, const std::vector< Mat > &motions, std::pair< int, int > range, Mat *stabilizationMotions) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/d9/d76/classcv_1_1videostab_1_1MotionStabilizationPipeline.html#a3f4d3891b05955cd17d213dfcbca9ba1',1,'cv::videostab::MotionStabilizationPipeline::stabilize()']]], + ['stabilizedframes_962',['stabilizedFrames',['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#ab485476a24a32bcf7aaae31ce5669cb0',1,'cv::videostab::InpainterBase']]], + ['stabilizeframe_963',['stabilizeFrame',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aff4ee85e72d58fb3eb09c0f5c8a9314c',1,'cv::videostab::StabilizerBase']]], + ['stabilizerbase_964',['StabilizerBase',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#aac79382ab3f87247ddc01fe0aa86ea64',1,'cv::videostab::StabilizerBase']]], + ['stable_5fpartition_965',['stable_partition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga4396b91f26c7aaf0ae150a79ebd965b7',1,'std::stable_partition()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga4396b91f26c7aaf0ae150a79ebd965b7',1,'stable_partition()(Global Namespace)']]], + ['stable_5fsort_966',['stable_sort',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7d8bb8e52b7b0e80301dcbec17225b4a',1,'std::stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a3ce3aa8ac2297f8290939a7988596d',1,'std::stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7d8bb8e52b7b0e80301dcbec17225b4a',1,'stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a3ce3aa8ac2297f8290939a7988596d',1,'stable_sort(_RandomAccessIterator __first, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], + ['stablenorm_967',['stableNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab84d3e64f855813b1eea4202c0697dc1',1,'Eigen::MatrixBase::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab84d3e64f855813b1eea4202c0697dc1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ab84d3e64f855813b1eea4202c0697dc1',1,'MatrixBase< Solve< Decomposition, RhsType > >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'Eigen::VectorwiseOp::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Derived, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Derived, Vertical >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::stableNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#add48fd836be98ed280cac23518db0916',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::stableNorm()']]], + ['stablenormalize_968',['stableNormalize',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0b1443fa322615379557ade3399a3c3c',1,'Eigen::MatrixBase::stableNormalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0b1443fa322615379557ade3399a3c3c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::stableNormalize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0b1443fa322615379557ade3399a3c3c',1,'MatrixBase< Solve< Decomposition, RhsType > >::stableNormalize()']]], + ['stablenormalized_969',['stableNormalized',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a399dca938633b9f8df5ec4beefeccec0',1,'Eigen::MatrixBase::stableNormalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a399dca938633b9f8df5ec4beefeccec0',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::stableNormalized()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a399dca938633b9f8df5ec4beefeccec0',1,'MatrixBase< Solve< Decomposition, RhsType > >::stableNormalized()']]], + ['stack_970',['stack',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#ad95ef4166cdb0aa8bae1dcd7ae2839e4',1,'stack< _StateSeqT >::stack()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07827.html#ad95ef4166cdb0aa8bae1dcd7ae2839e4',1,'std::stack::stack()']]], + ['standardcollector_971',['StandardCollector',['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#a24e397f05bbfaa973ab519d000e559c6',1,'cv::face::StandardCollector']]], + ['starcensustransform_972',['starCensusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a6e3b6dac980497890a61871f3ad90ecb',1,'cv::stereo::starCensusTransform(const cv::Mat &img1, const cv::Mat &img2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2)'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#af1ad2e7309e42a42e92d65e13bb526ff',1,'cv::stereo::starCensusTransform(const cv::Mat &img1, int kernelSize, cv::Mat &dist)']]], + ['starkernelcensus_973',['StarKernelCensus',['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1stereo_1_1StarKernelCensus.html#af3ec4d3ebcfc04a3dcbd64c7139f8e23',1,'cv::stereo::StarKernelCensus']]], + ['start_974',['start',['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ac979183ede9856427ea8309a91843eaf',1,'cv::GStreamingCompiled::start()'],['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html#a564bc8b0bebcfc6c96f85fc48643e273',1,'cv::TickMeter::start()'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#a73a454d6769e4007da648d984e3193ce',1,'cv::ocl::Timer::start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5f0b7200c4a68f9b939ae84060439707',1,'std::gslice::start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac5e75a2dd40a49ee555fc35d0eeacc1a',1,'std::slice::start()'],['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html#a87f6bd02c5d093b812c0d4790b2181f3',1,'net::mc::tasks::PowerRepeatTask::start()'],['../classnet_1_1websocket_1_1SingleClientWSServer.html#ae5f4b4ef17fb26725e0c6d52909ec9da',1,'net::websocket::SingleClientWSServer::start()'],['../classutil_1_1AsyncTask.html#abe5a114fae049066657d73ccbdd9f3c3',1,'util::AsyncTask::start()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac5e75a2dd40a49ee555fc35d0eeacc1a',1,'start()(Global Namespace)']]], + ['start_5farray_975',['start_array',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a5c53878cf08d463eb4e7ca0270532572.html#a5c53878cf08d463eb4e7ca0270532572',1,'nlohmann::json_sax']]], + ['start_5fobject_976',['start_object',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a0671528b0debb5a348169d61f0382a0f.html#a0671528b0debb5a348169d61f0382a0f',1,'nlohmann::json_sax']]], + ['startloop_977',['startLoop',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gae1ae035082d76c7fb981203a974bd4ba',1,'cv::startLoop()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gae1ae035082d76c7fb981203a974bd4ba',1,'startLoop()(Global Namespace)']]], + ['startwindowthread_978',['startWindowThread',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga2c6ecef4f85d8e5cbefec39c9e82ece0',1,'cv::startWindowThread()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga2c6ecef4f85d8e5cbefec39c9e82ece0',1,'startWindowThread()(Global Namespace)']]], + ['startwriteavi_979',['startWriteAVI',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a96eb46757885d235b924d0e246d66ceb',1,'cv::AVIWriteContainer']]], + ['startwritechunk_980',['startWriteChunk',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a0628cd9ee5dcb6997dd233fc370e171c',1,'cv::AVIWriteContainer']]], + ['startwritestruct_981',['startWriteStruct',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a8bb8183cb82d1b3de9eceb13e44efbae',1,'cv::FileStorage']]], + ['state_982',['state',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a4e97b157edf8205bcc60347a86c9ed86',1,'std::fpos::state(_StateT __st)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#ab0b8ab377a6907428414353bca366234',1,'std::fpos::state() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05907.html#a9d0d2e818e6d6cc0b32e86c984561e6f',1,'std::wbuffer_convert::state()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05903.html#abd1382f21442adec3f9935d023017871',1,'std::wstring_convert::state()']]], + ['stateconversionfunction_983',['stateConversionFunction',['https://docs.opencv.org/4.2.0/da/d2b/classcv_1_1tracking_1_1UkfSystemModel.html#a5ab724eda5b79639eddcea6351c612fd',1,'cv::tracking::UkfSystemModel']]], + ['static_5fpointer_5fcast_984',['static_pointer_cast',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6a221c308f0ca0e44b5fffa32a6d4595',1,'std']]], + ['staticsaliencyfinegrained_985',['StaticSaliencyFineGrained',['https://docs.opencv.org/4.2.0/da/dd0/classcv_1_1saliency_1_1StaticSaliencyFineGrained.html#a282bc38fecc2a3d158b38eeadb289a00',1,'cv::saliency::StaticSaliencyFineGrained']]], + ['staticsaliencyspectralresidual_986',['StaticSaliencySpectralResidual',['https://docs.opencv.org/4.2.0/df/d37/classcv_1_1saliency_1_1StaticSaliencySpectralResidual.html#a5d691bad0bad797e0bbc0a0673987f54',1,'cv::saliency::StaticSaliencySpectralResidual']]], + ['stddev_987',['stddev',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a43aa93573bdffbacfde869b5a11bed31',1,'normal_distribution< double >::stddev()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a43aa93573bdffbacfde869b5a11bed31',1,'normal_distribution< result_type >::stddev()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a43aa93573bdffbacfde869b5a11bed31',1,'std::normal_distribution::stddev()']]], + ['stdev_988',['stdev',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1videostab_1_1GaussianMotionFilter.html#ac4150e7d3b37cdb95442e2a633941cb7',1,'cv::videostab::GaussianMotionFilter']]], + ['stdevthresh_989',['stdevThresh',['https://docs.opencv.org/4.2.0/d9/dba/classcv_1_1videostab_1_1ConsistentMosaicInpainter.html#acaf556d32a5248757702bd662fa8d901',1,'cv::videostab::ConsistentMosaicInpainter']]], + ['stdio_5ffilebuf_990',['stdio_filebuf',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#a8b64983961c6d4f32b5021a79ad39447',1,'__gnu_cxx::stdio_filebuf::stdio_filebuf()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#a777faeb6849444b4663d1cbe543e1ae3',1,'__gnu_cxx::stdio_filebuf::stdio_filebuf(int __fd, std::ios_base::openmode __mode, size_t __size=static_cast< size_t >(BUFSIZ))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10667.html#a197c58345703b4c82256fe5c1574273f',1,'__gnu_cxx::stdio_filebuf::stdio_filebuf(std::__c_file *__f, std::ios_base::openmode __mode, size_t __size=static_cast< size_t >(BUFSIZ))']]], + ['stdn_991',['stdn',['../namespaceutil.html#a1b6af13be4df99a79372afcde0448fe4',1,'util']]], + ['step_992',['step',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#aa91e7e76c9247f7192ab70d0c0be4783',1,'cv::_InputArray']]], + ['step1_993',['step1',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a5ead91d096cca20e59ba9af8574187cc',1,'cv::cuda::GpuMat::step1()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ad6ab81d95b0e52444250b136e0da3cfd',1,'cv::cudev::GpuMat_::step1()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ab51be367c23f9976389efd3eccbded97',1,'cv::cuda::HostMem::step1()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a0066c8eee40c1706395b1e57f00e0857',1,'cv::Mat::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'cv::Mat_::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< double >::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< float >::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< uchar >::step1()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4eebaf5bd5a6af36a32faa08da1f5920',1,'Mat_< unsigned char >::step1()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a5bcb8141a5651e69ceeabddf18d8ddfb',1,'cv::UMat::step1()']]], + ['stept_994',['stepT',['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a1d9a9d12ecf2297a3d540a1985d6f53a',1,'cv::cudev::GpuMat_::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'cv::Mat_::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< double >::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< float >::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< uchar >::stepT()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acd1c79dd8216941382635e84aa38d997',1,'Mat_< unsigned char >::stepT()']]], + ['stereocalibrate_995',['stereoCalibrate',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga91018d80e2a93ade37539f01e6f07de5',1,'cv::stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, InputOutputArray R, InputOutputArray T, OutputArray E, OutputArray F, OutputArray perViewErrors, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga246253dcc6de2e0376c599e7d692303a',1,'cv::stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, OutputArray R, OutputArray T, OutputArray E, OutputArray F, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gadbb3a6ca6429528ef302c784df47949b',1,'cv::fisheye::stereoCalibrate()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga6f1aa828b02e7263394acb5f6821cc84',1,'cv::omnidir::stereoCalibrate()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga91018d80e2a93ade37539f01e6f07de5',1,'stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, InputOutputArray R, InputOutputArray T, OutputArray E, OutputArray F, OutputArray perViewErrors, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga246253dcc6de2e0376c599e7d692303a',1,'stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray cameraMatrix1, InputOutputArray distCoeffs1, InputOutputArray cameraMatrix2, InputOutputArray distCoeffs2, Size imageSize, OutputArray R, OutputArray T, OutputArray E, OutputArray F, int flags=CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 30, 1e-6))(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gadbb3a6ca6429528ef302c784df47949b',1,'stereoCalibrate(InputArrayOfArrays objectPoints, InputArrayOfArrays imagePoints1, InputArrayOfArrays imagePoints2, InputOutputArray K1, InputOutputArray D1, InputOutputArray K2, InputOutputArray D2, Size imageSize, OutputArray R, OutputArray T, int flags=fisheye::CALIB_FIX_INTRINSIC, TermCriteria criteria=TermCriteria(TermCriteria::COUNT+TermCriteria::EPS, 100, DBL_EPSILON))(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga6f1aa828b02e7263394acb5f6821cc84',1,'stereoCalibrate(InputOutputArrayOfArrays objectPoints, InputOutputArrayOfArrays imagePoints1, InputOutputArrayOfArrays imagePoints2, const Size &imageSize1, const Size &imageSize2, InputOutputArray K1, InputOutputArray xi1, InputOutputArray D1, InputOutputArray K2, InputOutputArray xi2, InputOutputArray D2, OutputArray rvec, OutputArray tvec, OutputArrayOfArrays rvecsL, OutputArrayOfArrays tvecsL, int flags, TermCriteria criteria, OutputArray idx=noArray())(Global Namespace)']]], + ['stereographicwarper_996',['StereographicWarper',['https://docs.opencv.org/4.2.0/d1/d3d/classcv_1_1detail_1_1StereographicWarper.html#ac2af47f4b063b6c3d11c8ec0e54c5787',1,'cv::detail::StereographicWarper']]], + ['stereoreconstruct_997',['stereoReconstruct',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga907c0cb0b0ec8896f1e60510b546e63a',1,'cv::omnidir::stereoReconstruct()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#ga907c0cb0b0ec8896f1e60510b546e63a',1,'stereoReconstruct()(Global Namespace)']]], + ['stereorectify_998',['stereoRectify',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga617b1685d4059c6040827800e72ad2b6',1,'cv::stereoRectify()'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gac1af58774006689056b0f2ef1db55ecc',1,'cv::fisheye::stereoRectify()'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gaf055863d589cb166c23cc26fcaa6ce98',1,'cv::omnidir::stereoRectify()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga617b1685d4059c6040827800e72ad2b6',1,'stereoRectify(InputArray cameraMatrix1, InputArray distCoeffs1, InputArray cameraMatrix2, InputArray distCoeffs2, Size imageSize, InputArray R, InputArray T, OutputArray R1, OutputArray R2, OutputArray P1, OutputArray P2, OutputArray Q, int flags=CALIB_ZERO_DISPARITY, double alpha=-1, Size newImageSize=Size(), Rect *validPixROI1=0, Rect *validPixROI2=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html#gac1af58774006689056b0f2ef1db55ecc',1,'stereoRectify(InputArray K1, InputArray D1, InputArray K2, InputArray D2, const Size &imageSize, InputArray R, InputArray tvec, OutputArray R1, OutputArray R2, OutputArray P1, OutputArray P2, OutputArray Q, int flags, const Size &newImageSize=Size(), double balance=0.0, double fov_scale=1.0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html#gaf055863d589cb166c23cc26fcaa6ce98',1,'stereoRectify(InputArray R, InputArray T, OutputArray R1, OutputArray R2)(Global Namespace)']]], + ['stereorectifyuncalibrated_999',['stereoRectifyUncalibrated',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaadc5b14471ddc004939471339294f052',1,'cv::stereoRectifyUncalibrated()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gaadc5b14471ddc004939471339294f052',1,'stereoRectifyUncalibrated()(Global Namespace)']]], + ['stitch_1000',['stitch',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a37ee5bacf229e9d0fb9f97c8f5ed1acd',1,'cv::Stitcher::stitch(InputArrayOfArrays images, OutputArray pano)'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a3156a44286a7065ba9e8802023ad2074',1,'cv::Stitcher::stitch(InputArrayOfArrays images, InputArrayOfArrays masks, OutputArray pano)']]], + ['stitchingloglevel_1001',['stitchingLogLevel',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga7616573f03568a19c14e3333f104b2af',1,'cv::detail::stitchingLogLevel()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#ga7616573f03568a19c14e3333f104b2af',1,'stitchingLogLevel()(Global Namespace)']]], + ['stop_1002',['stop',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#ac4061f2d28cf54e48360c8aa06135f38',1,'cv::DetectionBasedTracker::stop()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ae8629e18974fc551af940062ad85a5a7',1,'cv::GStreamingCompiled::stop()'],['https://docs.opencv.org/4.2.0/d9/d6f/classcv_1_1TickMeter.html#aa6dfbdc68373d10e371bd35f92c7adb3',1,'cv::TickMeter::stop()'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#adf6487aa9d91d2282201b197b9bd41d3',1,'cv::ocl::Timer::stop()'],['../classnet_1_1mc_1_1tasks_1_1PowerRepeatTask.html#a7cdd54fa926ecd170ec4e7c215f50592',1,'net::mc::tasks::PowerRepeatTask::stop()'],['../classnet_1_1websocket_1_1SingleClientWSServer.html#ac6eba89635a679c01f7b6891123c1d80',1,'net::websocket::SingleClientWSServer::stop()'],['../classutil_1_1AsyncTask.html#a349580908c4774c5d99159f5be226f95',1,'util::AsyncTask::stop()']]], + ['stopentityanimation_1003',['stopEntityAnimation',['https://docs.opencv.org/4.2.0/d5/d68/classcv_1_1ovis_1_1WindowScene.html#af64b09bc3720eccdfdeaf13fcc5c8f27',1,'cv::ovis::WindowScene']]], + ['stoploop_1004',['stopLoop',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gad4783dd50a6844a04ac8cb4fe158fdf3',1,'cv::stopLoop()'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html#gad4783dd50a6844a04ac8cb4fe158fdf3',1,'stopLoop()(Global Namespace)']]], + ['str_1005',['str',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a8659c3a93da87fb8de3ca1fdd6c49bc0',1,'match_results< _Bi_iter >::str(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a8659c3a93da87fb8de3ca1fdd6c49bc0',1,'match_results< _Bi_iter >::str(size_type __sub=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02471.html#a8402e3c2b036fbd4c696b2ab70b49681',1,'std::basic_istringstream::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02471.html#a4040d59ec2be579cca6a91fb5595553e',1,'std::basic_istringstream::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02475.html#a5fe89030a53e674de2823d9a8cfec39c',1,'std::basic_ostringstream::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02475.html#a1bfbc5ef2c20f06dfbbe8bf046cffa3a',1,'std::basic_ostringstream::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a710ce01324037dd8787cde291a3608e0',1,'std::basic_stringbuf::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02467.html#a54d0b95ccabadaa97884f3c54f1943d2',1,'std::basic_stringbuf::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02479.html#a36e49da6993836a79290489fab310077',1,'std::basic_stringstream::str() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02479.html#a84b6a2da124b5f937c3f5dfa12d70957',1,'std::basic_stringstream::str(const __string_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a8659c3a93da87fb8de3ca1fdd6c49bc0',1,'std::match_results::str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#acf17e2826b47f664e97bcf9be35fd9f2',1,'std::sub_match::str()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#acf17e2826b47f664e97bcf9be35fd9f2',1,'sub_match< _Bi_iter >::str()']]], + ['stream_1006',['Stream',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#aa6434e2f5f29bd81406732b39951c246',1,'cv::cuda::Stream::Stream()'],['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a3da3061ab4b0c737fcb092494b54cec8',1,'cv::cuda::Stream::Stream(const Ptr< GpuMat::Allocator > &allocator)']]], + ['stride_1007',['Stride',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Eigen::Stride::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Eigen::Stride::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Eigen::Stride::Stride(Index outerStride, Index innerStride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Stride< 0, Value >::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Stride< 0, Value >::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Stride< 0, Value >::Stride(Index outerStride, Index innerStride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::Stride(Index outerStride, Index innerStride)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#ae3f37b08ff44d2afe971c0894c2f44a5',1,'Stride< Value, 0 >::Stride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#aa9bb1a33da8c785d9cc4ad5d799b9253',1,'Stride< Value, 0 >::Stride(const Stride &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a81e299d9d2f8bbfc6d240705dabe5833',1,'Stride< Value, 0 >::Stride(Index outerStride, Index innerStride)']]], + ['stride_1008',['stride',['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#af82410455b282716daa1c06401596c09',1,'NCVMatrix::stride()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8a9378455753dd979d6424bdff021820',1,'std::gslice::stride()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab9ee3d00a3ef2be02ac5895894b66ee7',1,'std::slice::stride()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab9ee3d00a3ef2be02ac5895894b66ee7',1,'stride()(Global Namespace)']]], + ['string_1009',['string',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ae7fa61092f596efa610a7f672885f3d6',1,'cv::FileNode::string()'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a07eab82f6c82d606787eee9ad73d2bda.html#a07eab82f6c82d606787eee9ad73d2bda',1,'nlohmann::json_sax::string()']]], + ['strip_1010',['strip',['https://docs.opencv.org/4.2.0/d3/d44/classcv_1_1GArray.html#a77da79851e07739edb1d3b869b485a1a',1,'cv::GArray::strip()'],['https://docs.opencv.org/4.2.0/d2/daf/namespacecv_1_1detail.html#aa3e0fd33a9587046335f9eb87e399f67',1,'cv::detail::strip()']]], + ['strongclassifierdirectselection_1011',['StrongClassifierDirectSelection',['https://docs.opencv.org/4.2.0/d4/d1e/classcv_1_1StrongClassifierDirectSelection.html#afc508b47e213b9a068c535a6da8d935b',1,'cv::StrongClassifierDirectSelection']]], + ['stylization_1012',['stylization',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#gacb0f7324017df153d7b5d095aed53206',1,'cv::stylization()'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#gacb0f7324017df153d7b5d095aed53206',1,'stylization()(Global Namespace)']]], + ['sub_1013',['sub',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gab2a1ac8bdeda1de78ec97f9cd8e9ff0a',1,'cv::gapi::sub()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gab2a1ac8bdeda1de78ec97f9cd8e9ff0a',1,'sub()(Global Namespace)']]], + ['sub16s_1014',['sub16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2168b6368851e50c8c6e5c1b39af2abb',1,'cv::hal::sub16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga2168b6368851e50c8c6e5c1b39af2abb',1,'sub16s()(Global Namespace)']]], + ['sub16u_1015',['sub16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38881a1fc619c13b879d08947a4f9038',1,'cv::hal::sub16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38881a1fc619c13b879d08947a4f9038',1,'sub16u()(Global Namespace)']]], + ['sub32f_1016',['sub32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7db1a88cf2010a1a413c8d83d46c8373',1,'cv::hal::sub32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7db1a88cf2010a1a413c8d83d46c8373',1,'sub32f()(Global Namespace)']]], + ['sub32s_1017',['sub32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gad6a86901a206d2c9dd37d693f05eece5',1,'cv::hal::sub32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gad6a86901a206d2c9dd37d693f05eece5',1,'sub32s()(Global Namespace)']]], + ['sub64f_1018',['sub64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabcefa88a20f298b67912d253ed180a5b',1,'cv::hal::sub64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabcefa88a20f298b67912d253ed180a5b',1,'sub64f()(Global Namespace)']]], + ['sub8s_1019',['sub8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a0c3f4922f9b2097b585085eae353dd',1,'cv::hal::sub8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9a0c3f4922f9b2097b585085eae353dd',1,'sub8s()(Global Namespace)']]], + ['sub8u_1020',['sub8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66404cf0bb4d0b827efad2c86f0b9139',1,'cv::hal::sub8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66404cf0bb4d0b827efad2c86f0b9139',1,'sub8u()(Global Namespace)']]], + ['subc_1021',['subC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa5979f64bab17bf1717f2842d6c1d53f',1,'cv::gapi::subC()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa5979f64bab17bf1717f2842d6c1d53f',1,'subC()(Global Namespace)']]], + ['subdiagonal_1022',['subDiagonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#ac423dbb91157c159bdcb4b5a8371232e',1,'Eigen::Tridiagonalization']]], + ['subdiv2d_1023',['Subdiv2D',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aed58be264a17cdbe712b6a35036d13cb',1,'cv::Subdiv2D::Subdiv2D()'],['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aa9ae8faa2f7a78428b115407bfc3df9e',1,'cv::Subdiv2D::Subdiv2D(Rect rect)']]], + ['submatrix_1024',['subMatrix',['https://docs.opencv.org/4.2.0/df/d9f/namespacecv_1_1omnidir_1_1internal.html#a892830aff7387b7fa15298250403c95a',1,'cv::omnidir::internal']]], + ['subrc_1025',['subRC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga755bf791d27f88ab5b4214575bf4c5a8',1,'cv::gapi::subRC()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga755bf791d27f88ab5b4214575bf4c5a8',1,'subRC()(Global Namespace)']]], + ['subspaceproject_1026',['subspaceProject',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a69c7019a344edc5c55799c16a9fc9ada',1,'cv::LDA']]], + ['subspacereconstruct_1027',['subspaceReconstruct',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#acbf9949e7567e23af5f71c29fcef76d4',1,'cv::LDA']]], + ['substr_1028',['substr',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab38b3bdb3cf4f19355202b28b8424997',1,'__gnu_cxx::__versa_string::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< _CharT >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< _CharT, _Traits, _Allocator >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< char >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< char, char_traits< char >, _Byte_alloc >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< char_type, _Traits, _Alloc >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'basic_string< value_type >::substr()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a25792c9769bbd22fccf887bf0be28556',1,'std::basic_string::substr()']]], + ['subtract_1029',['subtract',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#adf3a27e2d042073f2d765522c3f2c870',1,'cv::MatOp::subtract(const MatExpr &expr1, const MatExpr &expr2, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a29ace3bec7c07ca07a159c4c6f058ef1',1,'cv::MatOp::subtract(const Scalar &s, const MatExpr &expr, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa0f00d98b4b5edeaeb7b8333b2de353b',1,'cv::subtract()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga6eab60fc250059e2fda79c5636bd067f',1,'cv::cuda::subtract()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa0f00d98b4b5edeaeb7b8333b2de353b',1,'subtract(InputArray src1, InputArray src2, OutputArray dst, InputArray mask=noArray(), int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga6eab60fc250059e2fda79c5636bd067f',1,'subtract(InputArray src1, InputArray src2, OutputArray dst, InputArray mask=noArray(), int dtype=-1, Stream &stream=Stream::Null())(Global Namespace)']]], + ['subtract_5fwith_5fcarry_5fengine_1030',['subtract_with_carry_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a61f08bb272f27b8cbba12a25aee3c804',1,'std::subtract_with_carry_engine::subtract_with_carry_engine(result_type __sd)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#aeb01e590a5c84d08db8b5678ca774172',1,'std::subtract_with_carry_engine::subtract_with_carry_engine(_Sseq &__q)']]], + ['subtractive_5frng_1031',['subtractive_rng',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html#a4e0180804e5e548805eca04c560571d5',1,'__gnu_cxx::subtractive_rng::subtractive_rng(unsigned int __seed)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html#a8763d20bcd47a2f9acd2da92e39193a8',1,'__gnu_cxx::subtractive_rng::subtractive_rng()']]], + ['subtype_1032',['subtype',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_ac3ca9d09e55342f9588404e1dc2222f0.html#ac3ca9d09e55342f9588404e1dc2222f0',1,'nlohmann::byte_container_with_subtype']]], + ['suffix_1033',['suffix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aae76fe76fdc4f6f729e0a55c8c2d4aa4',1,'match_results< _Bi_iter >::suffix() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aae76fe76fdc4f6f729e0a55c8c2d4aa4',1,'match_results< _Bi_iter >::suffix() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aae76fe76fdc4f6f729e0a55c8c2d4aa4',1,'std::match_results::suffix()']]], + ['sum_1034',['sum',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabf296b8981ebb3c123b3ba99e753598f',1,'std::valarray::sum()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabf296b8981ebb3c123b3ba99e753598f',1,'valarray< size_t >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'Eigen::DenseBase::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'DenseBase< ArrayWrapper< ExpressionType > >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#addd7080d5c202795820e361768d0140c',1,'DenseBase< Solve< Decomposition, RhsType > >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'Eigen::SparseMatrix::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar, ColMajor, int >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a0700cd0b8658962d742fa51a5e594a2f',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#af48da9cac4c4d8d06d712f7ca4c81ed9',1,'Eigen::SparseVector::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'Eigen::VectorwiseOp::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Derived, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Derived, Vertical >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::sum()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7030fc687c24d687ed7cd70733ba611c',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::sum()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga716e10a2dd9e228e4d3c95818f106722',1,'cv::sum()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga1f582844670199281e8012733b50c582',1,'cv::cuda::sum()'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga58d80f9e109fed142b280d673afb795a',1,'cv::gapi::sum()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga716e10a2dd9e228e4d3c95818f106722',1,'sum(InputArray src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga58d80f9e109fed142b280d673afb795a',1,'sum(const GMat &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga1f582844670199281e8012733b50c582',1,'sum(InputArray src, InputArray mask=noArray())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabf296b8981ebb3c123b3ba99e753598f',1,'sum() const(Global Namespace)']]], + ['sum_5f_1035',['sum_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa34154947ab224684ddd1020f9e2fb3c',1,'cv::cudev::sum_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa34154947ab224684ddd1020f9e2fb3c',1,'sum_()(Global Namespace)']]], + ['sungetc_1036',['sungetc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'__gnu_cxx::enc_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'__gnu_cxx::stdio_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'__gnu_cxx::stdio_sync_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_filebuf< char_type, traits_type >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_streambuf< _Elem, _Tr >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_streambuf< char, _Traits >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'basic_streambuf< char, char_traits< char > >::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::basic_filebuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::basic_streambuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::basic_stringbuf::sungetc()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a8d42bd5b22d246f15a8dd0a8614c0e3f',1,'std::wbuffer_convert::sungetc()']]], + ['superresolution_1037',['SuperResolution',['https://docs.opencv.org/4.2.0/d9/dd6/classcv_1_1superres_1_1SuperResolution.html#a6b6da407515d5def4552cf513ae9e98a',1,'cv::superres::SuperResolution']]], + ['supportbackend_1038',['supportBackend',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a14017804fd5e8c28807263bbdb415383',1,'cv::dnn::Layer']]], + ['supports_1039',['supports',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a67e89f47a61b1bb016e3b20f644f762e',1,'cv::cuda::DeviceInfo']]], + ['suppress_1040',['suppress',['https://docs.opencv.org/4.2.0/d8/da1/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressor.html#aa829e4bb7e33b11567ec3f040e28a7fc',1,'cv::videostab::MoreAccurateMotionWobbleSuppressor::suppress()'],['https://docs.opencv.org/4.2.0/d0/da4/classcv_1_1videostab_1_1NullWobbleSuppressor.html#a73bca4742402ffcc348a9acbfc52d07b',1,'cv::videostab::NullWobbleSuppressor::suppress()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a1c39fa83a31e7c62d80b029b8cc19e80',1,'cv::videostab::WobbleSuppressorBase::suppress()']]], + ['suppress_5funused_5fwarning_1041',['suppress_unused_warning',['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a5f00f5a230b8dc4f63bdd1c8057ace44',1,'cv::util']]], + ['surf_5fcuda_1042',['SURF_CUDA',['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#ac6522a440dea4b95807d3a3b3417e6a0',1,'cv::cuda::SURF_CUDA::SURF_CUDA()'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a0f7077b5561a105841be6f1a46a29b6d',1,'cv::cuda::SURF_CUDA::SURF_CUDA(double _hessianThreshold, int _nOctaves=4, int _nOctaveLayers=2, bool _extended=false, float _keypointsRatio=0.01f, bool _upright=false)']]], + ['surfacealignment_1043',['surfaceAlignment',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a125e3c0cbd8c63d07637863dff8b0608',1,'cv::cuda::DeviceInfo']]], + ['svbacksubst_1044',['SVBackSubst',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab4e620e6fc6c8a27bb2be3d50a840c0b',1,'cv::SVBackSubst()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab4e620e6fc6c8a27bb2be3d50a840c0b',1,'SVBackSubst()(Global Namespace)']]], + ['svd_1045',['SVD',['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a3830f50d56ac2ff7b979e6f7f8991e36',1,'cv::SVD::SVD()'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#a54cb96aef54978a3617cb2a2169b689a',1,'cv::SVD::SVD(InputArray src, int flags=0)']]], + ['svd32f_1046',['SVD32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7e379c106c1228dcdac27bab1fb81c6e',1,'cv::hal::SVD32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga7e379c106c1228dcdac27bab1fb81c6e',1,'SVD32f()(Global Namespace)']]], + ['svd64f_1047',['SVD64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae50420ada479a479075a154a9e7fb642',1,'cv::hal::SVD64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae50420ada479a479075a154a9e7fb642',1,'SVD64f()(Global Namespace)']]], + ['svdbase_1048',['SVDBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#abed06fc6f4b743e1f76a7b317539da87',1,'Eigen::SVDBase::SVDBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#abed06fc6f4b743e1f76a7b317539da87',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::SVDBase()']]], + ['svdecomp_1049',['SVDecomp',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab477b5b7b39b370bb03e75b19d2d5109',1,'cv::SVDecomp()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab477b5b7b39b370bb03e75b19d2d5109',1,'SVDecomp()(Global Namespace)']]], + ['swap_1050',['swap',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a7135c058aef51c37884a2b2ae8151631',1,'cv::cuda::GpuMat::swap()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a0e1c66de99997b6fe13959dfb6794f2f',1,'cv::cudev::GpuMat_::swap()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a6eabc73d59936b87292125e17415b053',1,'cv::cuda::HostMem::swap()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#ac084b122b402d3c64976e0ccad57ddaf',1,'cv::util::optional::swap()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ac7471fa2590350e45b30cb72da0f7668',1,'cv::util::variant::swap()'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#ac7471fa2590350e45b30cb72da0f7668',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a05eed1a275b62f425fe4843edb708956',1,'__gnu_cxx::__versa_string::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'__gnu_debug::basic_string::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11783.html#a3a1a56d0954c344eb4db26dce4b84562',1,'__gnu_pbds::sample_probe_fn::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11787.html#a7a6dee2c024c6c77e605c9814e5979cb',1,'__gnu_pbds::sample_range_hashing::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11791.html#a72bbcd1a06b6196c03a35a880ba6ed72',1,'__gnu_pbds::sample_ranged_hash_fn::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12007.html#ae0e145612d3056d7186fffcacce2c85d',1,'__gnu_pbds::sample_resize_policy::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12011.html#a822549474a8d6f889f3aa0abf99656ce',1,'__gnu_pbds::sample_resize_trigger::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12015.html#a48c1b41db4e557029b119c8c5d6002f8',1,'__gnu_pbds::sample_size_policy::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#ad866a56fdeeed727b04774acdc78ab1e',1,'__gnu_pbds::sample_update_policy::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< _CharT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< _CharT, _Traits, _Allocator >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< char >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< char, char_traits< char >, _Byte_alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< char_type, _Traits, _Alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'basic_string< value_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a41f78615b6896d0b85bef3aea0e41f2f',1,'deque< _StateSeqT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#afca54335268365fbe964394a8fe5df1b',1,'list< __inp, __rebind_inp >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a104e0215b1b9709a9a3cef3280078ded',1,'match_results< _Bi_iter >::swap(match_results &__that) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'match_results< _Bi_iter >::swap(vector &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a104e0215b1b9709a9a3cef3280078ded',1,'match_results< _Bi_iter >::swap(match_results &__that) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a5cd0631c180f408fe3aa42a384bbaa74',1,'std::basic_regex::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0545aa0fb34370d0730659096d85db98',1,'std::basic_string::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a41f78615b6896d0b85bef3aea0e41f2f',1,'std::deque::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a767521afed6c6768073fdef22d2ed292',1,'std::experimental::fundamentals_v1::any::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a3c41eb7aabcd13c334d38bc68afe2cd8',1,'std::forward_list::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#ad6e98060b15f59120e426a787febf1a5',1,'std::function< _Res(_ArgTypes...)>::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#afca54335268365fbe964394a8fe5df1b',1,'std::list::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a6ab3829e42e61a94d9039fea4c07b62f',1,'std::map::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'std::match_results::swap(vector &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a104e0215b1b9709a9a3cef3280078ded',1,'std::match_results::swap(match_results &__that) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a65f198a3e5054fc993d8519127c7b314',1,'std::multimap::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a42f6bb9c9951b84e1876e29cd3b4b607',1,'std::multiset::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a2ad1ef1062ee331c848605434d1d5ef6',1,'std::set::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a2029b19ff5945268a03a130ee05e7e75',1,'std::tr2::dynamic_bitset::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'std::unique_ptr::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a6516afbc423bf1f13c37c3c0324fa0f9',1,'std::unique_ptr< _Tp[], _Dp >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae06bac0d1fbee8603ec2ac806950b1ba',1,'std::unordered_map::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac8d3f27e1315796ddcc9b55378f90ce7',1,'std::unordered_multimap::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a87b28725f19b4afc7e58d052bf07be2f',1,'std::unordered_multiset::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a688f24d7010519e2bfa001db6fe180e7',1,'std::unordered_set::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6033c5c6f21fed896e5ff6a06bba62b9',1,'std::valarray::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'std::vector::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Codecvt >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Res_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Result< _Res > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< _Result_base >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a20128902c397043453a90db55f4ea276',1,'unique_ptr< bool[]>::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae06bac0d1fbee8603ec2ac806950b1ba',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6033c5c6f21fed896e5ff6a06bba62b9',1,'valarray< size_t >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< __diff_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _CharClassT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _CharT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _Cmpt >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _Node *, _Nodeptr_Alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _RealType >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _State< _TraitsT::char_type > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< _StringT >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< block_type, allocator_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< Catalog_info * >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< double >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< int >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< result_type >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< size_t >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< std::pair< _BiIter, int > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< std::pair< _StateIdT, std::vector > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< std::pair< _StrTransT, _StrTransT > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< sub_match< _Bi_iter >, _Alloc >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a97d8ff35af22b6787d9aa7c60b2ba3ff',1,'vector< sub_match< _BiIter >, _Alloc >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'Eigen::DenseBase::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'Eigen::DenseBase::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'DenseBase< ArrayWrapper< ExpressionType > >::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'DenseBase< ArrayWrapper< ExpressionType > >::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af9e7e4305fdb7781f2b2f05fa801f21e',1,'DenseBase< Solve< Decomposition, RhsType > >::swap(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a44e25adc6da9cd1d79f4c5bd7c1819cb',1,'DenseBase< Solve< Decomposition, RhsType > >::swap(PlainObjectBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'Eigen::SparseMatrix::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar, ColMajor, int >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#ae9b9ad3524f87276511397d988b7a607',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseVector.html#af0902c911efcf6f162022175b3efd12b',1,'Eigen::SparseVector::swap()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a0c1ece2f97341c7c7e698d67343421a5',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::swap(MatrixBase< OtherDerived > const &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a4e16e0824796bfa218cc91da98fe05b1',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::swap(TriangularBase< OtherDerived > &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a94295a06e0e7b3867fe83afbee4cb202.html#a94295a06e0e7b3867fe83afbee4cb202',1,'nlohmann::basic_json::swap(reference other) noexcept(std::is_nothrow_move_constructible< value_t >::value &&std::is_nothrow_move_assignable< value_t >::value &&std::is_nothrow_move_constructible< json_value >::value &&std::is_nothrow_move_assignable< json_value >::value)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a76126242de262f6d38cadda19e0d13e1.html#a76126242de262f6d38cadda19e0d13e1',1,'nlohmann::basic_json::swap(array_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a57b86bdcfc55557dacc36969adb0417e.html#a57b86bdcfc55557dacc36969adb0417e',1,'nlohmann::basic_json::swap(object_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aac916df9561daf4eaf2372119fe91899.html#aac916df9561daf4eaf2372119fe91899',1,'nlohmann::basic_json::swap(string_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_aa242e339ebc7583e114f2167a83f8c90.html#aa242e339ebc7583e114f2167a83f8c90',1,'nlohmann::basic_json::swap(binary_t &other)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a749a1f5091a5e63ccfe919e0aef986af.html#a749a1f5091a5e63ccfe919e0aef986af',1,'nlohmann::basic_json::swap(typename binary_t::container_type &other)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gafbc8f513f40dc1b7c2d48ea6a5a81776',1,'cv::swap(Mat &a, Mat &b)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaac41913cb7239fd2771b3c3f25349fe0',1,'cv::swap(UMat &a, UMat &b)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gafbc8f513f40dc1b7c2d48ea6a5a81776',1,'swap(Mat &a, Mat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaac41913cb7239fd2771b3c3f25349fe0',1,'swap(UMat &a, UMat &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ac29506dd75ee99d6a88ade595233c6f8',1,'__gnu_cxx::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9d75305041fc556b922d4b3bd2667742',1,'std::swap(pair< _T1, _T2 > &__x, pair< _T1, _T2 > &__y) noexcept(noexcept(__x.swap(__y)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4d5a9efe4608a61cb6c74ddda7f8728f',1,'std::swap(function< _Res(_Args...)> &__x, function< _Res(_Args...)> &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga8cdf0d24423573721c4bdb9b2ffd8a7d',1,'std::swap(basic_regex< _Ch_type, _Rx_traits > &__lhs, basic_regex< _Ch_type, _Rx_traits > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a87939e8186f838ff337074e945c78b6d',1,'std::swap(basic_stringbuf< _CharT, _Traits, _Allocator > &__x, basic_stringbuf< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4dedd893b6faf3eb2e6c6aa0ca0f2e32',1,'std::swap(basic_istringstream< _CharT, _Traits, _Allocator > &__x, basic_istringstream< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab7f8e65ad7deb2a81c9178499d71731a',1,'std::swap(basic_ostringstream< _CharT, _Traits, _Allocator > &__x, basic_ostringstream< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a85a913837de066af6c23b0f4f28e02a0',1,'std::swap(basic_stringstream< _CharT, _Traits, _Allocator > &__x, basic_stringstream< _CharT, _Traits, _Allocator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4007a6b034645ec64b2d436df27a03ec',1,'std::swap(multiset< _Key, _Compare, _Alloc > &__x, multiset< _Key, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9bbb29387dfd4bfad2ef30fb555f649a',1,'std::swap(set< _Key, _Compare, _Alloc > &__x, set< _Key, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae448a7aacea236579e3f239c9448482f',1,'std::swap(multimap< _Key, _Tp, _Compare, _Alloc > &__x, multimap< _Key, _Tp, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab99dc85cd3551cb410655b02a56e5c15',1,'std::swap(basic_filebuf< _CharT, _Traits > &__x, basic_filebuf< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acfe891185fde2307f6e8909338c7b862',1,'std::swap(basic_ifstream< _CharT, _Traits > &__x, basic_ifstream< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4965e732ce5d02e4304dd82bc86e365a',1,'std::swap(basic_ofstream< _CharT, _Traits > &__x, basic_ofstream< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7ccd229f5faee26395b8ee1715576cf0',1,'std::swap(basic_fstream< _CharT, _Traits > &__x, basic_fstream< _CharT, _Traits > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aeb866eb47db586b6058b597e97d8b909',1,'std::swap(forward_list< _Tp, _Alloc > &__lx, forward_list< _Tp, _Alloc > &__ly) noexcept(noexcept(__lx.swap(__ly)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a520781978c7299c8f0e206542178d09c',1,'std::swap(map< _Key, _Tp, _Compare, _Alloc > &__x, map< _Key, _Tp, _Compare, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga2700089f8b9371e6aafdb9a7e7a552e7',1,'std::swap(packaged_task< _Res(_ArgTypes...)> &__x, packaged_task< _Res(_ArgTypes...)> &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga77f74f34f378f6d6b5b987ab9a684c2d',1,'std::swap(tuple< _Elements... > &__x, tuple< _Elements... > &__y) noexcept(noexcept(__x.swap(__y)))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a89a3a6f9c11a9ade523d0be6e5b3a190',1,'std::swap(vector< _Tp, _Alloc > &__x, vector< _Tp, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e4c5e4d115e26e6d2e4adf552d9a90',1,'std::swap(match_results< _Bi_iter, _Alloc > &__lhs, match_results< _Bi_iter, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a335bd8d8bfd13a75e2e5c34552ec3daf',1,'std::swap(list< _Tp, _Alloc > &__x, list< _Tp, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7e6765b86dfe7f33455aec5b8a7f7e2e',1,'std::swap(deque< _Tp, _Alloc > &__x, deque< _Tp, _Alloc > &__y) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gafa6fdf3b3bd0b4a333f150d62001e9fc',1,'std::swap(_Tp &__a, _Tp &__b) noexcept(__and_< is_nothrow_move_constructible< _Tp >, is_nothrow_move_assignable< _Tp > >::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga6b5d2a0f9529c41034917992630c6c85',1,'std::swap(_Tp(&__a)[_Nm], _Tp(&__b)[_Nm]) noexcept(__is_nothrow_swappable< _Tp >::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0be9c6cc80dd454ea2212c47538c61c4',1,'std::swap(basic_string< _CharT, _Traits, _Alloc > &__lhs, basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac58580a65df691769770684cc985719d',1,'std::swap(unique_lock< _Mutex > &__x, unique_lock< _Mutex > &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga0d3de8f7ff80877e53d25ca9057e1c0f',1,'std::swap(shared_lock< _Mutex > &__x, shared_lock< _Mutex > &__y) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a9f4d5ac9d6926c4a0e2d97179887cb6c',1,'std::__debug::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a416f44c6d2ed7e920c8bab2362ce8ffb',1,'std::__profile::swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html#ga2700089f8b9371e6aafdb9a7e7a552e7',1,'swap(packaged_task< _Res(_ArgTypes...)> &__x, packaged_task< _Res(_ArgTypes...)> &__y) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga0d3de8f7ff80877e53d25ca9057e1c0f',1,'swap(shared_lock< _Mutex > &__x, shared_lock< _Mutex > &__y) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6033c5c6f21fed896e5ff6a06bba62b9',1,'swap(valarray< _Tp > &__v) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga8cdf0d24423573721c4bdb9b2ffd8a7d',1,'swap(basic_regex< _Ch_type, _Rx_traits > &__lhs, basic_regex< _Ch_type, _Rx_traits > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e4c5e4d115e26e6d2e4adf552d9a90',1,'swap(match_results< _Bi_iter, _Alloc > &__lhs, match_results< _Bi_iter, _Alloc > &__rhs) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html#ga8007443c4b8291e332ef93b1875440b9',1,'swap(any &__x, any &__y) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9d75305041fc556b922d4b3bd2667742',1,'swap(pair< _T1, _T2 > &__x, pair< _T1, _T2 > &__y) noexcept(noexcept(__x.swap(__y)))(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga77f74f34f378f6d6b5b987ab9a684c2d',1,'swap(tuple< _Elements... > &__x, tuple< _Elements... > &__y) noexcept(noexcept(__x.swap(__y)))(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gafa6fdf3b3bd0b4a333f150d62001e9fc',1,'swap(_Tp &__a, _Tp &__b) noexcept(__and_< is_nothrow_move_constructible< _Tp >, is_nothrow_move_assignable< _Tp > >::value)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga6b5d2a0f9529c41034917992630c6c85',1,'swap(_Tp(&__a)[_Nm], _Tp(&__b)[_Nm]) noexcept(__is_nothrow_swappable< _Tp >::value)(Global Namespace)']]], + ['swap_5franges_1051',['swap_ranges',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gae9603907c05659cb5cfc6ea20be9ae01',1,'std::swap_ranges()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gae9603907c05659cb5cfc6ea20be9ae01',1,'swap_ranges()(Global Namespace)']]], + ['swapchannels_1052',['swapChannels',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga75a29cc4a97cde0d43ea066b01de927e',1,'cv::cuda::swapChannels()'],['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html#ga75a29cc4a97cde0d43ea066b01de927e',1,'swapChannels()(Global Namespace)']]], + ['swapedges_1053',['swapEdges',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a1e1fb5d4dceadb03ac61c678cf1afb7f',1,'cv::Subdiv2D']]], + ['swapendian_1054',['swapEndian',['https://docs.opencv.org/4.2.0/d2/d15/classcv_1_1cnn__3dobj_1_1icoSphere.html#abe2a117d06ff01ec0ce31782cf2aff52',1,'cv::cnn_3dobj::icoSphere']]], + ['swapfeature_1055',['swapFeature',['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a64898258ae7de0da05dc80bc18c29c32',1,'cv::TrackerFeatureHAAR::swapFeature(int source, int target)'],['https://docs.opencv.org/4.2.0/d6/d00/classcv_1_1TrackerFeatureHAAR.html#a50d20081386f85b3dabe20caa1d229a8',1,'cv::TrackerFeatureHAAR::swapFeature(int id, CvHaarEvaluator::FeatureHaar &feature)']]], + ['swervedrivekinematics_1056',['SwerveDriveKinematics',['../classkinematics_1_1SwerveDriveKinematics.html#aacea45f4e805cb42850ddb1fd7e7533f',1,'kinematics::SwerveDriveKinematics']]], + ['switchtoselectivesearchfast_1057',['switchToSelectiveSearchFast',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a4ea50c9a9df83193dc16f9b74bd95805',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], + ['switchtoselectivesearchquality_1058',['switchToSelectiveSearchQuality',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a4824333bbdd5877e14859298a2ecde12',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], + ['switchtosinglestrategy_1059',['switchToSingleStrategy',['https://docs.opencv.org/4.2.0/d6/d6d/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentation.html#a15995e73a7476442dda5b4210e1e177a',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentation']]], + ['symbolvalue_1060',['SymbolValue',['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolValue.html#a2db2a280f108f3253e4f21858a2d14ca',1,'Eigen::symbolic::SymbolValue']]], + ['symedge_1061',['symEdge',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#aabbb10b8d5b0311b7e22040fc0db56b4',1,'cv::Subdiv2D']]], + ['symetriccensus_1062',['SymetricCensus',['https://docs.opencv.org/4.2.0/dd/d24/classcv_1_1stereo_1_1SymetricCensus.html#aec7d620a84cd10c722ff58dee97734c4',1,'cv::stereo::SymetricCensus']]], + ['symetriccensustransform_1063',['symetricCensusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a36512a3362c08ac5f26e9c7e7eca1abb',1,'cv::stereo::symetricCensusTransform(const cv::Mat &img1, const cv::Mat &img2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2, const int type)'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a966b36bd327d3da0025d71fa41d361c2',1,'cv::stereo::symetricCensusTransform(const cv::Mat &img1, int kernelSize, cv::Mat &dist1, const int type)']]], + ['sync_1064',['sync',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'__gnu_cxx::enc_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'__gnu_cxx::stdio_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10671.html#aaf870a6b01d27af87ca27c16e601d1df',1,'__gnu_cxx::stdio_sync_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'basic_filebuf< char_type, traits_type >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_iostream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_iostream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char, _Traits >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'basic_istream< char, _Traits >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'basic_streambuf< _Elem, _Tr >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'basic_streambuf< char, _Traits >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'basic_streambuf< char, char_traits< char > >::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02067.html#af42cd30ec66c6eb0df56026098b6e04f',1,'std::basic_filebuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_fstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_fstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_ifstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_ifstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_iostream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_iostream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_istringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'std::basic_streambuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a407510ac810a42b173f3bd553959bfb5',1,'std::basic_stringbuf::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_stringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af3f3c68797d19724d8add89b15a08908',1,'std::basic_stringstream::sync()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05907.html#aba9f090cf1273168ea80a024419dab92',1,'std::wbuffer_convert::sync()']]], + ['sync_5fwith_5fstdio_1065',['sync_with_stdio',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_ios< char, _Traits >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_iostream< char >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_istream< char >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_istream< char, _Traits >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_ostream< char >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'basic_ostream< char, _Traits >::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_fstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ifstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ios::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_iostream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_istream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_istringstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ofstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ostream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_ostringstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::basic_stringstream::sync_with_stdio()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#aade35b0cc25dc04d3b9b598182ec72b5',1,'std::ios_base::sync_with_stdio()']]], + ['syntheticsequencegenerator_1066',['SyntheticSequenceGenerator',['https://docs.opencv.org/4.2.0/d1/dda/classcv_1_1bgsegm_1_1SyntheticSequenceGenerator.html#a1252da52b70175c097e304334a0723b6',1,'cv::bgsegm::SyntheticSequenceGenerator']]] ]; diff --git a/search/functions_14.js b/search/functions_14.js index 2a3b3d40..c317c274 100644 --- a/search/functions_14.js +++ b/search/functions_14.js @@ -19,8 +19,8 @@ var searchData= ['tempfile_16',['tempfile',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga9fcedbe6d0104d7ce012987478b060d4',1,'cv::tempfile()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga9fcedbe6d0104d7ce012987478b060d4',1,'tempfile()(Global Namespace)']]], ['temporary_5fbuffer_17',['temporary_buffer',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09223.html#a984575528c7bf7f532c7ff4b16a6a09c',1,'__gnu_cxx::temporary_buffer']]], ['tempumat_18',['tempUMat',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#ae0fe4f5c2d26556d535bc86b02a424d1',1,'cv::UMatData']]], - ['termcriteria_19',['termCriteria',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a0e91ee6fb4015df0a8ba29485fe0cd26',1,'cv::detail::BundleAdjusterBase']]], - ['termcriteria_20',['TermCriteria',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#ae3130f54d419687a87349da94df1226b',1,'cv::TermCriteria::TermCriteria()'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#aa6ec470a6a29edadcdd5e94e114960f6',1,'cv::TermCriteria::TermCriteria(int type, int maxCount, double epsilon)']]], + ['termcriteria_19',['TermCriteria',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#ae3130f54d419687a87349da94df1226b',1,'cv::TermCriteria::TermCriteria()'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#aa6ec470a6a29edadcdd5e94e114960f6',1,'cv::TermCriteria::TermCriteria(int type, int maxCount, double epsilon)']]], + ['termcriteria_20',['termCriteria',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a0e91ee6fb4015df0a8ba29485fe0cd26',1,'cv::detail::BundleAdjusterBase']]], ['terminate_21',['terminate',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#add3befe08cc677fe78f3e6f6b0c6d29b',1,'std']]], ['test_22',['test',['https://docs.opencv.org/4.2.0/d3/dc8/structcv_1_1detail_1_1has__custom__wrap.html#a3ab3936ed06e2c59320b9ced7b5e5db9',1,'cv::detail::has_custom_wrap::test(check< C, decltype(&GTypeTraits< C >::wrap_value)> *)'],['https://docs.opencv.org/4.2.0/d3/dc8/structcv_1_1detail_1_1has__custom__wrap.html#a02664452df328aeeec0207725f0ed14f',1,'cv::detail::has_custom_wrap::test(...)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#abb1381e9fd6c77312c8a18b2089b5e96',1,'std::bitset::test()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ad5a3a2e3dfac03daf4a39f919e28de55',1,'std::tr2::dynamic_bitset::test()']]], ['test_5fpoint_23',['test_point',['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#aa2ed8d5803b1461ebd18729eb0d82061',1,'cv::detail::Timelapser']]], @@ -128,52 +128,51 @@ var searchData= ['training_125',['training',['https://docs.opencv.org/4.2.0/dc/de0/classcv_1_1face_1_1FacemarkKazemi.html#a7a1e85e9d726ac0f7ea4ad20b8f68f09',1,'cv::face::FacemarkKazemi::training()'],['https://docs.opencv.org/4.2.0/d3/d81/classcv_1_1face_1_1FacemarkTrain.html#adde846fe7b183b963a4ef04bc7d8d98c',1,'cv::face::FacemarkTrain::training()']]], ['trainm_126',['trainM',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ac21fbae3a09972de0a0a1cb4c2c434d0',1,'cv::ml::EM']]], ['trainmodel_127',['trainModel',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#acd125802f8339b1ecb67316318a4670d',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['transform_128',['transform',['https://docs.opencv.org/4.2.0/df/d29/classcv_1_1cuda_1_1LookUpTable.html#afdbcbd3047f847451892f3b18cd018de',1,'cv::cuda::LookUpTable::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#af4d286d995ec6ff200854960c15b78c8',1,'regex_traits< _CharType >::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ada536ca81b2869cfe04ccb92bc42282e',1,'std::collate::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ada536ca81b2869cfe04ccb92bc42282e',1,'std::collate_byname::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#af4d286d995ec6ff200854960c15b78c8',1,'std::regex_traits::transform()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ab078178e1abfbd078b27ade489b93303',1,'Eigen::AlignedBox::transform(const Transform< Scalar, AmbientDimAtCompileTime, Mode, Options > &transform)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#aa39225243d4aca173391c0bb24d89b46',1,'Eigen::AlignedBox::transform(const typename Transform< Scalar, AmbientDimAtCompileTime, Mode, Options >::TranslationType &translation)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ae89b4a512bfb4acbf6192b37c89d1552',1,'Eigen::Hyperplane::transform(const MatrixBase< XprType > &mat, TransformTraits traits=Affine)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ae07794d268e45fd513a17c49b9a6ec81',1,'Eigen::Hyperplane::transform(const Transform< Scalar, AmbientDimAtCompileTime, Affine, TrOptions > &t, TransformTraits traits=Affine)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a1c2a0ceacef80e76b71f56992a721e6a',1,'Eigen::ParametrizedLine::transform(const MatrixBase< XprType > &mat, TransformTraits traits=Affine)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a09d711ff37c2f421c65f398b9c7120b1',1,'Eigen::ParametrizedLine::transform(const Transform< Scalar, AmbientDimAtCompileTime, Affine, TrOptions > &t, TransformTraits traits=Affine)'],['../classrobot_1_1types_1_1DataPoint.html#a8650e0e36ef570694b8cddd666c12b9e',1,'robot::types::DataPoint::transform()']]], - ['transform_129',['Transform',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a19d71151dfbbe89db15961c93726dd70',1,'Eigen::Transform::Transform()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aec37de6bc74c0769dc4e47ba759bf9ec',1,'Eigen::Transform::Transform(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a83d61d4a1bd1c502c97ad67f87d55006',1,'Eigen::Transform::Transform(const QMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a63e9a5b9cf964921c24023dd680dee6d',1,'Eigen::Transform::Transform(const QTransform &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a2c3e732625ec300ef4e4cb1e17a82d35',1,'Eigen::Transform::Transform(const Transform< OtherScalarType, Dim, Mode, Options > &other)']]], - ['transform_130',['transform',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga393164aa54bb9169ce0a8cc44e08ff22',1,'cv::transform()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga393164aa54bb9169ce0a8cc44e08ff22',1,'transform()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga475f12632a75f77b41aa843dfddfe422',1,'std::transform(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _UnaryOperation __unary_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga92e41473c3907d39cbc98ab6bea346fe',1,'std::transform(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _OutputIterator __result, _BinaryOperation __binary_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga475f12632a75f77b41aa843dfddfe422',1,'transform(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _UnaryOperation __unary_op)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga92e41473c3907d39cbc98ab6bea346fe',1,'transform(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _OutputIterator __result, _BinaryOperation __binary_op)(Global Namespace)']]], - ['transform_5fbboxes_131',['transform_bboxes',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a0e8ce822b1e0f50026fabd6492feeaa7',1,'cv::dnn_objdetect::InferBbox']]], - ['transform_5fbboxes_5finv_132',['transform_bboxes_inv',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a43a0eefb42e9c57c5de9cb976a41e3a4',1,'cv::dnn_objdetect::InferBbox']]], - ['transform_5fprimary_133',['transform_primary',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a31b5b84c5919d3fd0658cf8c18df0160',1,'regex_traits< _CharType >::transform_primary()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a31b5b84c5919d3fd0658cf8c18df0160',1,'std::regex_traits::transform_primary()']]], - ['transformation_134',['transformation',['https://docs.opencv.org/4.2.0/db/d1f/classcv_1_1GTransformImpl_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#ad8a474251aeaec92fa67bf0fe0353e41',1,'cv::GTransformImpl< K, std::function< R(Args...)> >']]], - ['transformed_135',['transformed',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#abe249d52c411b1c9a6771d4ee379b9bf',1,'Eigen::AlignedBox']]], - ['transformfd_136',['transformFD',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#ga95f303288dac0e02ab3777b603933921',1,'cv::ximgproc::transformFD()'],['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#ga95f303288dac0e02ab3777b603933921',1,'transformFD()(Global Namespace)']]], - ['transformpcpose_137',['transformPCPose',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab21c92ff881ae85b72c552e7e6e52c55',1,'cv::ppf_match_3d::transformPCPose()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab21c92ff881ae85b72c552e7e6e52c55',1,'transformPCPose()(Global Namespace)']]], - ['transformpoints_138',['transformPoints',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gab6ea2bd4162efd48f2b027d21d0b7f56',1,'cv::cuda::transformPoints()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gab6ea2bd4162efd48f2b027d21d0b7f56',1,'transformPoints()(Global Namespace)']]], - ['transformptr_139',['transformPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fa9448a29af2c0d25ecbeec292957a',1,'cv::cudev::transformPtr(const SrcPtr &src, const Op &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be7d3b72b752cf6d55f6c0b1d8e3a37',1,'cv::cudev::transformPtr(const Src1Ptr &src1, const Src2Ptr &src2, const Op &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fa9448a29af2c0d25ecbeec292957a',1,'transformPtr(const SrcPtr &src, const Op &op)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be7d3b72b752cf6d55f6c0b1d8e3a37',1,'transformPtr(const Src1Ptr &src1, const Src2Ptr &src2, const Op &op)(Global Namespace)']]], - ['transformreadings_140',['transformReadings',['../namespaceutil.html#aae9ae4acf4ddb63d9633bb398b0616ee',1,'util']]], - ['transformtraj_141',['transformTraj',['../namespaceutil.html#a56fdb65ab2da6e0935db38a4a7a403fa',1,'util']]], - ['translate_142',['translate',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a11d9cdc588a9c08c0c1c205a872663fd',1,'cv::Affine3::translate()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a11d9cdc588a9c08c0c1c205a872663fd',1,'Affine3< float >::translate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a001a4c2c5d9b06d4cc7e9a83310255c4',1,'regex_traits< _CharType >::translate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a001a4c2c5d9b06d4cc7e9a83310255c4',1,'std::regex_traits::translate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a319e3e6338893db6986533d545a92046',1,'Eigen::AlignedBox::translate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aa28c8ebe8367243653e8fb151670b24b',1,'Eigen::Transform::translate()']]], - ['translate_5fnocase_143',['translate_nocase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#aa92edaaafe63f2333dc9d1ce9167c0f3',1,'regex_traits< _CharType >::translate_nocase()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#aa92edaaafe63f2333dc9d1ce9167c0f3',1,'std::regex_traits::translate_nocase()']]], - ['translated_144',['translated',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a3d7dad56b2c9b6e3dc360c078c639f47',1,'Eigen::AlignedBox']]], + ['transform_128',['Transform',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a19d71151dfbbe89db15961c93726dd70',1,'Eigen::Transform::Transform()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aec37de6bc74c0769dc4e47ba759bf9ec',1,'Eigen::Transform::Transform(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a83d61d4a1bd1c502c97ad67f87d55006',1,'Eigen::Transform::Transform(const QMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a63e9a5b9cf964921c24023dd680dee6d',1,'Eigen::Transform::Transform(const QTransform &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a2c3e732625ec300ef4e4cb1e17a82d35',1,'Eigen::Transform::Transform(const Transform< OtherScalarType, Dim, Mode, Options > &other)']]], + ['transform_129',['transform',['https://docs.opencv.org/4.2.0/df/d29/classcv_1_1cuda_1_1LookUpTable.html#afdbcbd3047f847451892f3b18cd018de',1,'cv::cuda::LookUpTable::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#af4d286d995ec6ff200854960c15b78c8',1,'regex_traits< _CharType >::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ada536ca81b2869cfe04ccb92bc42282e',1,'std::collate::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ada536ca81b2869cfe04ccb92bc42282e',1,'std::collate_byname::transform()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#af4d286d995ec6ff200854960c15b78c8',1,'std::regex_traits::transform()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ab078178e1abfbd078b27ade489b93303',1,'Eigen::AlignedBox::transform(const Transform< Scalar, AmbientDimAtCompileTime, Mode, Options > &transform)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#aa39225243d4aca173391c0bb24d89b46',1,'Eigen::AlignedBox::transform(const typename Transform< Scalar, AmbientDimAtCompileTime, Mode, Options >::TranslationType &translation)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ae89b4a512bfb4acbf6192b37c89d1552',1,'Eigen::Hyperplane::transform(const MatrixBase< XprType > &mat, TransformTraits traits=Affine)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Hyperplane.html#ae07794d268e45fd513a17c49b9a6ec81',1,'Eigen::Hyperplane::transform(const Transform< Scalar, AmbientDimAtCompileTime, Affine, TrOptions > &t, TransformTraits traits=Affine)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a1c2a0ceacef80e76b71f56992a721e6a',1,'Eigen::ParametrizedLine::transform(const MatrixBase< XprType > &mat, TransformTraits traits=Affine)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ParametrizedLine.html#a09d711ff37c2f421c65f398b9c7120b1',1,'Eigen::ParametrizedLine::transform(const Transform< Scalar, AmbientDimAtCompileTime, Affine, TrOptions > &t, TransformTraits traits=Affine)'],['../classrobot_1_1types_1_1DataPoint.html#a8650e0e36ef570694b8cddd666c12b9e',1,'robot::types::DataPoint::transform()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga393164aa54bb9169ce0a8cc44e08ff22',1,'cv::transform()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga393164aa54bb9169ce0a8cc44e08ff22',1,'transform()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga475f12632a75f77b41aa843dfddfe422',1,'std::transform(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _UnaryOperation __unary_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga92e41473c3907d39cbc98ab6bea346fe',1,'std::transform(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _OutputIterator __result, _BinaryOperation __binary_op)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga475f12632a75f77b41aa843dfddfe422',1,'transform(_InputIterator __first, _InputIterator __last, _OutputIterator __result, _UnaryOperation __unary_op)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga92e41473c3907d39cbc98ab6bea346fe',1,'transform(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _OutputIterator __result, _BinaryOperation __binary_op)(Global Namespace)']]], + ['transform_5fbboxes_130',['transform_bboxes',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a0e8ce822b1e0f50026fabd6492feeaa7',1,'cv::dnn_objdetect::InferBbox']]], + ['transform_5fbboxes_5finv_131',['transform_bboxes_inv',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a43a0eefb42e9c57c5de9cb976a41e3a4',1,'cv::dnn_objdetect::InferBbox']]], + ['transform_5fprimary_132',['transform_primary',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a31b5b84c5919d3fd0658cf8c18df0160',1,'regex_traits< _CharType >::transform_primary()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a31b5b84c5919d3fd0658cf8c18df0160',1,'std::regex_traits::transform_primary()']]], + ['transformation_133',['transformation',['https://docs.opencv.org/4.2.0/db/d1f/classcv_1_1GTransformImpl_3_01K_00_01std_1_1function_3_01R_07Args_8_8_8_08_4_01_4.html#ad8a474251aeaec92fa67bf0fe0353e41',1,'cv::GTransformImpl< K, std::function< R(Args...)> >']]], + ['transformed_134',['transformed',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#abe249d52c411b1c9a6771d4ee379b9bf',1,'Eigen::AlignedBox']]], + ['transformfd_135',['transformFD',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#ga95f303288dac0e02ab3777b603933921',1,'cv::ximgproc::transformFD()'],['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html#ga95f303288dac0e02ab3777b603933921',1,'transformFD()(Global Namespace)']]], + ['transformpcpose_136',['transformPCPose',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab21c92ff881ae85b72c552e7e6e52c55',1,'cv::ppf_match_3d::transformPCPose()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab21c92ff881ae85b72c552e7e6e52c55',1,'transformPCPose()(Global Namespace)']]], + ['transformpoints_137',['transformPoints',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gab6ea2bd4162efd48f2b027d21d0b7f56',1,'cv::cuda::transformPoints()'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gab6ea2bd4162efd48f2b027d21d0b7f56',1,'transformPoints()(Global Namespace)']]], + ['transformptr_138',['transformPtr',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fa9448a29af2c0d25ecbeec292957a',1,'cv::cudev::transformPtr(const SrcPtr &src, const Op &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be7d3b72b752cf6d55f6c0b1d8e3a37',1,'cv::cudev::transformPtr(const Src1Ptr &src1, const Src2Ptr &src2, const Op &op)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fa9448a29af2c0d25ecbeec292957a',1,'transformPtr(const SrcPtr &src, const Op &op)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be7d3b72b752cf6d55f6c0b1d8e3a37',1,'transformPtr(const Src1Ptr &src1, const Src2Ptr &src2, const Op &op)(Global Namespace)']]], + ['transformreadings_139',['transformReadings',['../namespaceutil.html#aae9ae4acf4ddb63d9633bb398b0616ee',1,'util']]], + ['transformtraj_140',['transformTraj',['../namespaceutil.html#a56fdb65ab2da6e0935db38a4a7a403fa',1,'util']]], + ['translate_141',['translate',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a11d9cdc588a9c08c0c1c205a872663fd',1,'cv::Affine3::translate()'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a11d9cdc588a9c08c0c1c205a872663fd',1,'Affine3< float >::translate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a001a4c2c5d9b06d4cc7e9a83310255c4',1,'regex_traits< _CharType >::translate()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#a001a4c2c5d9b06d4cc7e9a83310255c4',1,'std::regex_traits::translate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a319e3e6338893db6986533d545a92046',1,'Eigen::AlignedBox::translate()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aa28c8ebe8367243653e8fb151670b24b',1,'Eigen::Transform::translate()']]], + ['translate_5fnocase_142',['translate_nocase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#aa92edaaafe63f2333dc9d1ce9167c0f3',1,'regex_traits< _CharType >::translate_nocase()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06759.html#aa92edaaafe63f2333dc9d1ce9167c0f3',1,'std::regex_traits::translate_nocase()']]], + ['translated_143',['translated',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a3d7dad56b2c9b6e3dc360c078c639f47',1,'Eigen::AlignedBox']]], + ['translation_144',['Translation',['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a7e74484699e17444c6d660c17117bf7b',1,'Eigen::Translation::Translation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a3048c4c2cf095548454aef051af5a036',1,'Eigen::Translation::Translation(const Translation< OtherScalarType, Dim > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#aef1fd431ac3f2197a8e33ce6d4163061',1,'Eigen::Translation::Translation(const VectorType &vector)']]], ['translation_145',['translation',['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#af0df7115f87f425839a7a3f2e4e1ed17',1,'cv::Affine3::translation(const Vec3 &t)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a19e2decf4df4a6e72118f9ef6482d502',1,'cv::Affine3::translation() const'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#af0df7115f87f425839a7a3f2e4e1ed17',1,'Affine3< float >::translation(const Vec3 &t)'],['https://docs.opencv.org/4.2.0/dd/d99/classcv_1_1Affine3.html#a19e2decf4df4a6e72118f9ef6482d502',1,'Affine3< float >::translation() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#aa3e4201cc8d1fd98136af66544148dc7',1,'Eigen::Transform::translation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#adf4c6d97bd3f10edfa95bb04331ec8ed',1,'Eigen::Transform::translation() const']]], - ['translation_146',['Translation',['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a7e74484699e17444c6d660c17117bf7b',1,'Eigen::Translation::Translation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a3048c4c2cf095548454aef051af5a036',1,'Eigen::Translation::Translation(const Translation< OtherScalarType, Dim > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#aef1fd431ac3f2197a8e33ce6d4163061',1,'Eigen::Translation::Translation(const VectorType &vector)']]], - ['translationbasedlocaloutlierrejector_147',['TranslationBasedLocalOutlierRejector',['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a52028c031cc736c093fa42975fad4884',1,'cv::videostab::TranslationBasedLocalOutlierRejector']]], - ['transpccoeff_148',['transPCCoeff',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab6d5a91876b73a024830da8405909b79',1,'cv::ppf_match_3d::transPCCoeff()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab6d5a91876b73a024830da8405909b79',1,'transPCCoeff()(Global Namespace)']]], - ['transpose_149',['transpose',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ad6293cc8922e39419ca4a91e9343f51b',1,'cv::MatOp::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'Eigen::DenseBase::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'DenseBase< ArrayWrapper< ExpressionType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'DenseBase< Solve< Decomposition, RhsType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ae0959abb2cfa16c9df2e5782e721811c',1,'Eigen::HouseholderSequence::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html#ab40e9cdc4582593511e57ee896e055a2',1,'Eigen::JacobiRotation::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'Eigen::PermutationBase::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< PermutationWrapper< _IndicesType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad779637ca3e3aeff2d35e1806e59f7d9',1,'Eigen::SelfAdjointView::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a33950671584ae306fbdc1c23f010be88',1,'Eigen::SelfAdjointView::transpose() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad779637ca3e3aeff2d35e1806e59f7d9',1,'SelfAdjointView< const Derived, UpLo >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a33950671584ae306fbdc1c23f010be88',1,'SelfAdjointView< const Derived, UpLo >::transpose() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'Eigen::SolverBase::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< FullPivLU< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< HouseholderQR< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< LLT< _MatrixType, _UpLo > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< PartialPivLU< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< SVDBase< Derived > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a4ecc54d938d8d0049cb821e92c6a7d60',1,'Eigen::SparseLU::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ac9efe6f446781eb1eb6e62d4a7707fd4',1,'Eigen::TriangularView::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#aa45efa0f1d6f8c009b75a4f6fc00e063',1,'Eigen::TriangularView::transpose() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ac9efe6f446781eb1eb6e62d4a7707fd4',1,'TriangularView< const Derived, Mode >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#aa45efa0f1d6f8c009b75a4f6fc00e063',1,'TriangularView< const Derived, Mode >::transpose() const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga46630ed6c0ea6254a35f447289bd7404',1,'cv::transpose()'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga327b71c3cb811a904ccf5fba37fc29f2',1,'cv::cuda::transpose()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga46630ed6c0ea6254a35f447289bd7404',1,'transpose(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga327b71c3cb811a904ccf5fba37fc29f2',1,'transpose(InputArray src1, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['transpose_5f_150',['transpose_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab945e9df9fdb4ad2e224d1caa8bad265',1,'cv::cudev::transpose_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab945e9df9fdb4ad2e224d1caa8bad265',1,'transpose_()(Global Namespace)']]], - ['transposeinplace_151',['transposeInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'Eigen::DenseBase::transposeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'DenseBase< ArrayWrapper< ExpressionType > >::transposeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::transposeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'DenseBase< Solve< Decomposition, RhsType > >::transposeInPlace()']]], - ['transpositions_152',['Transpositions',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a415e07d885093f3f256394f59d4986f4',1,'Eigen::Transpositions::Transpositions(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#aae3eb58072f5b26f3851925eec5a006f',1,'Eigen::Transpositions::Transpositions(const TranspositionsBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a6a02dae883f9bc072de3268e1696d0ba',1,'Eigen::Transpositions::Transpositions(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a415e07d885093f3f256394f59d4986f4',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::Transpositions(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#aae3eb58072f5b26f3851925eec5a006f',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::Transpositions(const TranspositionsBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a6a02dae883f9bc072de3268e1696d0ba',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::Transpositions(Index size)']]], - ['transpositionsp_153',['transpositionsP',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a47257d3500f9f7c9a4478158d0e34941',1,'Eigen::LDLT']]], - ['transversemercatorwarper_154',['TransverseMercatorWarper',['https://docs.opencv.org/4.2.0/d4/d6b/classcv_1_1detail_1_1TransverseMercatorWarper.html#a15da1369124f1c12a32e14edd68a897a',1,'cv::detail::TransverseMercatorWarper']]], - ['trapezoidalvelocityprofile_155',['TrapezoidalVelocityProfile',['../classcontrol_1_1TrapezoidalVelocityProfile.html#a1957617258addd8a7a71d86801cc893e',1,'control::TrapezoidalVelocityProfile']]], - ['tree_156',['tree',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#a5c900b3230feb9f5c59bf80995eaa2b1',1,'__gnu_pbds::tree::tree(const cmp_fn &c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#a9d2c8a45cf06ac2da54bef2ff3514468',1,'__gnu_pbds::tree::tree(It first, It last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#a75e6c7ff0c466d02e91bfe5243684109',1,'__gnu_pbds::tree::tree(It first, It last, const cmp_fn &c)']]], - ['triangularview_157',['triangularView',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a56665aa894f49f2765291fee0eaeb9c6',1,'Eigen::MatrixBase::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aa044521145e74117ad1df42460d7b520',1,'Eigen::MatrixBase::triangularView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a56665aa894f49f2765291fee0eaeb9c6',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aa044521145e74117ad1df42460d7b520',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::triangularView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a56665aa894f49f2765291fee0eaeb9c6',1,'MatrixBase< Solve< Decomposition, RhsType > >::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aa044521145e74117ad1df42460d7b520',1,'MatrixBase< Solve< Decomposition, RhsType > >::triangularView() const']]], - ['triangulatepoints_158',['triangulatePoints',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad3fc9a0c82b08df034234979960b778c',1,'cv::triangulatePoints()'],['https://docs.opencv.org/4.2.0/d0/dbd/group__triangulation.html#ga211c855276b3084f3bbd8b2d9161dc74',1,'cv::sfm::triangulatePoints()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad3fc9a0c82b08df034234979960b778c',1,'triangulatePoints(InputArray projMatr1, InputArray projMatr2, InputArray projPoints1, InputArray projPoints2, OutputArray points4D)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/dbd/group__triangulation.html#ga211c855276b3084f3bbd8b2d9161dc74',1,'triangulatePoints(InputArrayOfArrays points2d, InputArrayOfArrays projection_matrices, OutputArray points3d)(Global Namespace)']]], - ['tridiagonalization_159',['Tridiagonalization',['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a05406b7df9a92fdcba72d31443f67a98',1,'Eigen::Tridiagonalization::Tridiagonalization(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a9ea2e6154bf35494ee68e037f0867cbd',1,'Eigen::Tridiagonalization::Tridiagonalization(Index size=Size==Dynamic ? 2 :Size)']]], - ['trie_160',['trie',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html#a5feddcc5a253f6fc4ff4567ad0359b6d',1,'__gnu_pbds::trie::trie(const access_traits &t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html#a0aaac7de1516a27993552064782cdec2',1,'__gnu_pbds::trie::trie(It first, It last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html#a0f9b513af82c2a51ba44849a2155096d',1,'__gnu_pbds::trie::trie(It first, It last, const access_traits &t)']]], - ['trimratio_161',['trimRatio',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#ab78d50ac661348fce0fd26c247bb85c6',1,'cv::videostab::LpMotionStabilizer::trimRatio()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#afc3dbde54f82fac976999469e049a3db',1,'cv::videostab::StabilizerBase::trimRatio()']]], - ['truename_162',['truename',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a226b1f5216eec8172bf4b71bede27a74',1,'std::numpunct::truename()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a226b1f5216eec8172bf4b71bede27a74',1,'std::numpunct_byname::truename()']]], - ['try_5flock_163',['try_lock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab431f6ac9476a921df98db8862be201a',1,'std']]], - ['try_5fpull_164',['try_pull',['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#af4a40c09634ba45686b2177f38c49022',1,'cv::GStreamingCompiled']]], - ['tryattach_165',['tryAttach',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#afd329d7dfd4e38239bef14ecee9977cb',1,'cv::dnn::Layer']]], - ['tryfuse_166',['tryFuse',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#ae52d400e21d50885742aed859ce732ba',1,'cv::dnn::Layer']]], - ['tryinitcontroller_167',['tryInitController',['../classcontrol_1_1PlanarArmController.html#a70e57f603057bcf79cf4524315be38c0',1,'control::PlanarArmController']]], - ['tuple_5fcat_168',['tuple_cat',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga23a2e3e40fefd39ffe278df7ebbd52a0',1,'std::tuple_cat()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga23a2e3e40fefd39ffe278df7ebbd52a0',1,'tuple_cat()(Global Namespace)']]], - ['turquoise_169',['turquoise',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a6b3ce38104fa104c33c3ef353052a3ab',1,'cv::viz::Color']]], - ['twistedby_170',['twistedBy',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'Eigen::SparseMatrixBase::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< Transpose< MatrixType > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#acde15b45cf7b43520e1005ec65d55f3c',1,'Eigen::SparseSelfAdjointView::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#acde15b45cf7b43520e1005ec65d55f3c',1,'SparseSelfAdjointView< const Derived, UpLo >::twistedBy()']]], - ['twopassstabilizer_171',['TwoPassStabilizer',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a6d8ba225fb09b05323886e9195f8589b',1,'cv::videostab::TwoPassStabilizer']]], - ['type_172',['type',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#aad62862c81d1d5bdf3f6597a32585844',1,'cv::_InputArray::type()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#acdbc4c711bfbf0c8be705398e4ca583e',1,'cv::ogl::Buffer::type()'],['https://docs.opencv.org/4.2.0/dc/d89/structcv_1_1flann_1_1CvType_3_01char_01_4.html#a3bb1d61d10c2013d99637a15fe327569',1,'cv::flann::CvType< char >::type()'],['https://docs.opencv.org/4.2.0/dc/d69/structcv_1_1flann_1_1CvType_3_01double_01_4.html#a2f87d947b1f72e0c80650fc657e1cbec',1,'cv::flann::CvType< double >::type()'],['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1flann_1_1CvType_3_01float_01_4.html#ae7bbff9f8eb419211f60dba3fb96bd04',1,'cv::flann::CvType< float >::type()'],['https://docs.opencv.org/4.2.0/d2/def/structcv_1_1flann_1_1CvType_3_01short_01_4.html#a578abd72b21a13835ad2539c4b09751b',1,'cv::flann::CvType< short >::type()'],['https://docs.opencv.org/4.2.0/d7/da5/structcv_1_1flann_1_1CvType_3_01unsigned_01char_01_4.html#aa68ea25cde8d8bdbab5ab3c1856a4b68',1,'cv::flann::CvType< unsigned char >::type()'],['https://docs.opencv.org/4.2.0/d9/d57/structcv_1_1flann_1_1CvType_3_01unsigned_01short_01_4.html#ab4c8c75d6aa55b00f8edc13f7e5368be',1,'cv::flann::CvType< unsigned short >::type()'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ac8cfab2ef82010b6505683000e3652f7',1,'cv::ocl::Device::type()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ad0fd448e25719a94320ebe574b87f997',1,'cv::FileNode::type()'],['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#a0d183c893967e06ed760d7d2dd4f4669',1,'cv::optflow::GPCTrainingSamples::type()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ab0c835e86e2af3c8fc14fee8a2937281',1,'cv::cuda::GpuMat::type()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#aca78acd1e054a20caf3427c2a36e898e',1,'cv::cudev::GpuMat_::type()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ac55673be0aa82cc6dbe7b17cf2c480ce',1,'cv::cuda::HostMem::type()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af2d2652e552d7de635988f18a84b53e5',1,'cv::Mat::type()'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#abff622ef7ef3019c18800de316c08963',1,'cv::gapi::own::Mat::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'cv::Mat_::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< double >::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< float >::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< uchar >::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< unsigned char >::type()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a65fb8ae8f21a136edfe6da122c5466fb',1,'cv::MatExpr::type()'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ac9fe29306a3f2243d2596180a37f4281',1,'cv::MatOp::type()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a3331bffc1409d61631d223169a950b25',1,'cv::SparseMat::type()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#abcd902283fa4eb7556499d0729196b30',1,'cv::SparseMat_::type()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a65194dd922bef59b349a4148cd39d675',1,'cv::UMat::type()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a283ebc4f962a66404be06dcbb512eff4',1,'std::experimental::fundamentals_v1::any::type()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5b7c4b35a0ad9f97474912a08965d7ad.html#a5b7c4b35a0ad9f97474912a08965d7ad',1,'nlohmann::basic_json::type() const noexcept']]], - ['type_5fname_173',['type_name',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a459dbfcd47bd632ca82ca8ff8db278c8.html#a459dbfcd47bd632ca82ca8ff8db278c8',1,'nlohmann::basic_json']]], - ['typetostr_174',['typeToStr',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga332498ad6301e733151ff4e61e0d755c',1,'cv::ocl::typeToStr()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga332498ad6301e733151ff4e61e0d755c',1,'typeToStr()(Global Namespace)']]], - ['typetostring_175',['typeToString',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a2b314c09591d8f79c334b7fd9dd3a9fd',1,'cv']]] + ['translationbasedlocaloutlierrejector_146',['TranslationBasedLocalOutlierRejector',['https://docs.opencv.org/4.2.0/dd/d13/classcv_1_1videostab_1_1TranslationBasedLocalOutlierRejector.html#a52028c031cc736c093fa42975fad4884',1,'cv::videostab::TranslationBasedLocalOutlierRejector']]], + ['transpccoeff_147',['transPCCoeff',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab6d5a91876b73a024830da8405909b79',1,'cv::ppf_match_3d::transPCCoeff()'],['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html#gab6d5a91876b73a024830da8405909b79',1,'transPCCoeff()(Global Namespace)']]], + ['transpose_148',['transpose',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ad6293cc8922e39419ca4a91e9343f51b',1,'cv::MatOp::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'Eigen::DenseBase::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'DenseBase< ArrayWrapper< ExpressionType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac575a73f01b20b628bb910d0f395cb33',1,'DenseBase< Solve< Decomposition, RhsType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ae0959abb2cfa16c9df2e5782e721811c',1,'Eigen::HouseholderSequence::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html#ab40e9cdc4582593511e57ee896e055a2',1,'Eigen::JacobiRotation::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'Eigen::PermutationBase::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a05805e9f4182eec3f6632e1c765b5ffe',1,'PermutationBase< PermutationWrapper< _IndicesType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad779637ca3e3aeff2d35e1806e59f7d9',1,'Eigen::SelfAdjointView::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a33950671584ae306fbdc1c23f010be88',1,'Eigen::SelfAdjointView::transpose() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#ad779637ca3e3aeff2d35e1806e59f7d9',1,'SelfAdjointView< const Derived, UpLo >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a33950671584ae306fbdc1c23f010be88',1,'SelfAdjointView< const Derived, UpLo >::transpose() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'Eigen::SolverBase::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< ColPivHouseholderQR< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< ColPivHouseholderQR< MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< CompleteOrthogonalDecomposition< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< FullPivHouseholderQR< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< FullPivLU< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< HouseholderQR< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< LDLT< _MatrixType, _UpLo > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< LLT< _MatrixType, _UpLo > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< PartialPivLU< _MatrixType > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< SVDBase< Derived > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SolverBase.html#a732e75b5132bb4db3775916927b0e86c',1,'SolverBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a4ecc54d938d8d0049cb821e92c6a7d60',1,'Eigen::SparseLU::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ac9efe6f446781eb1eb6e62d4a7707fd4',1,'Eigen::TriangularView::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#aa45efa0f1d6f8c009b75a4f6fc00e063',1,'Eigen::TriangularView::transpose() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ac9efe6f446781eb1eb6e62d4a7707fd4',1,'TriangularView< const Derived, Mode >::transpose()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#aa45efa0f1d6f8c009b75a4f6fc00e063',1,'TriangularView< const Derived, Mode >::transpose() const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga46630ed6c0ea6254a35f447289bd7404',1,'cv::transpose()'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga327b71c3cb811a904ccf5fba37fc29f2',1,'cv::cuda::transpose()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga46630ed6c0ea6254a35f447289bd7404',1,'transpose(InputArray src, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#ga327b71c3cb811a904ccf5fba37fc29f2',1,'transpose(InputArray src1, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], + ['transpose_5f_149',['transpose_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab945e9df9fdb4ad2e224d1caa8bad265',1,'cv::cudev::transpose_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab945e9df9fdb4ad2e224d1caa8bad265',1,'transpose_()(Global Namespace)']]], + ['transposeinplace_150',['transposeInPlace',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'Eigen::DenseBase::transposeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'DenseBase< ArrayWrapper< ExpressionType > >::transposeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::transposeInPlace()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac501bd942994af7a95d95bee7a16ad2a',1,'DenseBase< Solve< Decomposition, RhsType > >::transposeInPlace()']]], + ['transpositions_151',['Transpositions',['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a415e07d885093f3f256394f59d4986f4',1,'Eigen::Transpositions::Transpositions(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#aae3eb58072f5b26f3851925eec5a006f',1,'Eigen::Transpositions::Transpositions(const TranspositionsBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a6a02dae883f9bc072de3268e1696d0ba',1,'Eigen::Transpositions::Transpositions(Index size)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a415e07d885093f3f256394f59d4986f4',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::Transpositions(const MatrixBase< Other > &indices)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#aae3eb58072f5b26f3851925eec5a006f',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::Transpositions(const TranspositionsBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a6a02dae883f9bc072de3268e1696d0ba',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::Transpositions(Index size)']]], + ['transpositionsp_152',['transpositionsP',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a47257d3500f9f7c9a4478158d0e34941',1,'Eigen::LDLT']]], + ['transversemercatorwarper_153',['TransverseMercatorWarper',['https://docs.opencv.org/4.2.0/d4/d6b/classcv_1_1detail_1_1TransverseMercatorWarper.html#a15da1369124f1c12a32e14edd68a897a',1,'cv::detail::TransverseMercatorWarper']]], + ['trapezoidalvelocityprofile_154',['TrapezoidalVelocityProfile',['../classcontrol_1_1TrapezoidalVelocityProfile.html#a1957617258addd8a7a71d86801cc893e',1,'control::TrapezoidalVelocityProfile']]], + ['tree_155',['tree',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#a5c900b3230feb9f5c59bf80995eaa2b1',1,'__gnu_pbds::tree::tree(const cmp_fn &c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#a9d2c8a45cf06ac2da54bef2ff3514468',1,'__gnu_pbds::tree::tree(It first, It last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11115.html#a75e6c7ff0c466d02e91bfe5243684109',1,'__gnu_pbds::tree::tree(It first, It last, const cmp_fn &c)']]], + ['triangularview_156',['triangularView',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a56665aa894f49f2765291fee0eaeb9c6',1,'Eigen::MatrixBase::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aa044521145e74117ad1df42460d7b520',1,'Eigen::MatrixBase::triangularView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a56665aa894f49f2765291fee0eaeb9c6',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aa044521145e74117ad1df42460d7b520',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::triangularView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a56665aa894f49f2765291fee0eaeb9c6',1,'MatrixBase< Solve< Decomposition, RhsType > >::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aa044521145e74117ad1df42460d7b520',1,'MatrixBase< Solve< Decomposition, RhsType > >::triangularView() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#aacba330c3a12d1cac75c2f9df8c0f347',1,'Eigen::SelfAdjointView::triangularView()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#aacba330c3a12d1cac75c2f9df8c0f347',1,'SelfAdjointView< const Derived, UpLo >::triangularView()']]], + ['triangulatepoints_157',['triangulatePoints',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad3fc9a0c82b08df034234979960b778c',1,'cv::triangulatePoints()'],['https://docs.opencv.org/4.2.0/d0/dbd/group__triangulation.html#ga211c855276b3084f3bbd8b2d9161dc74',1,'cv::sfm::triangulatePoints()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gad3fc9a0c82b08df034234979960b778c',1,'triangulatePoints(InputArray projMatr1, InputArray projMatr2, InputArray projPoints1, InputArray projPoints2, OutputArray points4D)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/dbd/group__triangulation.html#ga211c855276b3084f3bbd8b2d9161dc74',1,'triangulatePoints(InputArrayOfArrays points2d, InputArrayOfArrays projection_matrices, OutputArray points3d)(Global Namespace)']]], + ['tridiagonalization_158',['Tridiagonalization',['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a05406b7df9a92fdcba72d31443f67a98',1,'Eigen::Tridiagonalization::Tridiagonalization(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a9ea2e6154bf35494ee68e037f0867cbd',1,'Eigen::Tridiagonalization::Tridiagonalization(Index size=Size==Dynamic ? 2 :Size)']]], + ['trie_159',['trie',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html#a5feddcc5a253f6fc4ff4567ad0359b6d',1,'__gnu_pbds::trie::trie(const access_traits &t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html#a0aaac7de1516a27993552064782cdec2',1,'__gnu_pbds::trie::trie(It first, It last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11119.html#a0f9b513af82c2a51ba44849a2155096d',1,'__gnu_pbds::trie::trie(It first, It last, const access_traits &t)']]], + ['trimratio_160',['trimRatio',['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#ab78d50ac661348fce0fd26c247bb85c6',1,'cv::videostab::LpMotionStabilizer::trimRatio()'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#afc3dbde54f82fac976999469e049a3db',1,'cv::videostab::StabilizerBase::trimRatio()']]], + ['truename_161',['truename',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a226b1f5216eec8172bf4b71bede27a74',1,'std::numpunct::truename()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#a226b1f5216eec8172bf4b71bede27a74',1,'std::numpunct_byname::truename()']]], + ['try_5flock_162',['try_lock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab431f6ac9476a921df98db8862be201a',1,'std']]], + ['try_5fpull_163',['try_pull',['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#af4a40c09634ba45686b2177f38c49022',1,'cv::GStreamingCompiled']]], + ['tryattach_164',['tryAttach',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#afd329d7dfd4e38239bef14ecee9977cb',1,'cv::dnn::Layer']]], + ['tryfuse_165',['tryFuse',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#ae52d400e21d50885742aed859ce732ba',1,'cv::dnn::Layer']]], + ['tryinitcontroller_166',['tryInitController',['../classcontrol_1_1PlanarArmController.html#a70e57f603057bcf79cf4524315be38c0',1,'control::PlanarArmController']]], + ['tuple_5fcat_167',['tuple_cat',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga23a2e3e40fefd39ffe278df7ebbd52a0',1,'std::tuple_cat()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga23a2e3e40fefd39ffe278df7ebbd52a0',1,'tuple_cat()(Global Namespace)']]], + ['turquoise_168',['turquoise',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a6b3ce38104fa104c33c3ef353052a3ab',1,'cv::viz::Color']]], + ['twistedby_169',['twistedBy',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'Eigen::SparseMatrixBase::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< Transpose< MatrixType > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a51d4898bd6a57cc3ba543a39b102423e',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#acde15b45cf7b43520e1005ec65d55f3c',1,'Eigen::SparseSelfAdjointView::twistedBy()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#acde15b45cf7b43520e1005ec65d55f3c',1,'SparseSelfAdjointView< const Derived, UpLo >::twistedBy()']]], + ['twopassstabilizer_170',['TwoPassStabilizer',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a6d8ba225fb09b05323886e9195f8589b',1,'cv::videostab::TwoPassStabilizer']]], + ['type_171',['type',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#aad62862c81d1d5bdf3f6597a32585844',1,'cv::_InputArray::type()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#acdbc4c711bfbf0c8be705398e4ca583e',1,'cv::ogl::Buffer::type()'],['https://docs.opencv.org/4.2.0/dc/d89/structcv_1_1flann_1_1CvType_3_01char_01_4.html#a3bb1d61d10c2013d99637a15fe327569',1,'cv::flann::CvType< char >::type()'],['https://docs.opencv.org/4.2.0/dc/d69/structcv_1_1flann_1_1CvType_3_01double_01_4.html#a2f87d947b1f72e0c80650fc657e1cbec',1,'cv::flann::CvType< double >::type()'],['https://docs.opencv.org/4.2.0/dc/dd6/structcv_1_1flann_1_1CvType_3_01float_01_4.html#ae7bbff9f8eb419211f60dba3fb96bd04',1,'cv::flann::CvType< float >::type()'],['https://docs.opencv.org/4.2.0/d2/def/structcv_1_1flann_1_1CvType_3_01short_01_4.html#a578abd72b21a13835ad2539c4b09751b',1,'cv::flann::CvType< short >::type()'],['https://docs.opencv.org/4.2.0/d7/da5/structcv_1_1flann_1_1CvType_3_01unsigned_01char_01_4.html#aa68ea25cde8d8bdbab5ab3c1856a4b68',1,'cv::flann::CvType< unsigned char >::type()'],['https://docs.opencv.org/4.2.0/d9/d57/structcv_1_1flann_1_1CvType_3_01unsigned_01short_01_4.html#ab4c8c75d6aa55b00f8edc13f7e5368be',1,'cv::flann::CvType< unsigned short >::type()'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ac8cfab2ef82010b6505683000e3652f7',1,'cv::ocl::Device::type()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#ad0fd448e25719a94320ebe574b87f997',1,'cv::FileNode::type()'],['https://docs.opencv.org/4.2.0/d5/d49/classcv_1_1optflow_1_1GPCTrainingSamples.html#a0d183c893967e06ed760d7d2dd4f4669',1,'cv::optflow::GPCTrainingSamples::type()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ab0c835e86e2af3c8fc14fee8a2937281',1,'cv::cuda::GpuMat::type()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#aca78acd1e054a20caf3427c2a36e898e',1,'cv::cudev::GpuMat_::type()'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#ac55673be0aa82cc6dbe7b17cf2c480ce',1,'cv::cuda::HostMem::type()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af2d2652e552d7de635988f18a84b53e5',1,'cv::Mat::type()'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#abff622ef7ef3019c18800de316c08963',1,'cv::gapi::own::Mat::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'cv::Mat_::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< double >::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< float >::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< uchar >::type()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a7d00371725868ec63c3adc6ddc987876',1,'Mat_< unsigned char >::type()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a65fb8ae8f21a136edfe6da122c5466fb',1,'cv::MatExpr::type()'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ac9fe29306a3f2243d2596180a37f4281',1,'cv::MatOp::type()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a3331bffc1409d61631d223169a950b25',1,'cv::SparseMat::type()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#abcd902283fa4eb7556499d0729196b30',1,'cv::SparseMat_::type()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a65194dd922bef59b349a4148cd39d675',1,'cv::UMat::type()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a283ebc4f962a66404be06dcbb512eff4',1,'std::experimental::fundamentals_v1::any::type()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a5b7c4b35a0ad9f97474912a08965d7ad.html#a5b7c4b35a0ad9f97474912a08965d7ad',1,'nlohmann::basic_json::type() const noexcept']]], + ['type_5fname_172',['type_name',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a459dbfcd47bd632ca82ca8ff8db278c8.html#a459dbfcd47bd632ca82ca8ff8db278c8',1,'nlohmann::basic_json']]], + ['typetostr_173',['typeToStr',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga332498ad6301e733151ff4e61e0d755c',1,'cv::ocl::typeToStr()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga332498ad6301e733151ff4e61e0d755c',1,'typeToStr()(Global Namespace)']]], + ['typetostring_174',['typeToString',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a2b314c09591d8f79c334b7fd9dd3a9fd',1,'cv']]] ]; diff --git a/search/functions_16.js b/search/functions_16.js index 92e06a74..05ee06af 100644 --- a/search/functions_16.js +++ b/search/functions_16.js @@ -153,8 +153,8 @@ var searchData= ['vcmpne2_150',['vcmpne2',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafec1064313a526d42093e9970dc6fe4',1,'cv::cudev::vcmpne2()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafec1064313a526d42093e9970dc6fe4',1,'vcmpne2()(Global Namespace)']]], ['vcmpne4_151',['vcmpne4',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga313926d4ce24905c750d65a00f4de0ac',1,'cv::cudev::vcmpne4()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga313926d4ce24905c750d65a00f4de0ac',1,'vcmpne4()(Global Namespace)']]], ['vconcat_152',['vconcat',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga744f53b69f6e4f12156cdde4e76aed27',1,'cv::vconcat(const Mat *src, size_t nsrc, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaad07cede730cdde64b90e987aad179b8',1,'cv::vconcat(InputArray src1, InputArray src2, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga558e169e15adcc46b8cdcc6cd215070f',1,'cv::vconcat(InputArrayOfArrays src, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga744f53b69f6e4f12156cdde4e76aed27',1,'vconcat(const Mat *src, size_t nsrc, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaad07cede730cdde64b90e987aad179b8',1,'vconcat(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga558e169e15adcc46b8cdcc6cd215070f',1,'vconcat(InputArrayOfArrays src, OutputArray dst)(Global Namespace)']]], - ['vec_153',['vec',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'Eigen::QuaternionBase::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'Eigen::QuaternionBase::vec() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::vec() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::vec() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::vec() const'],['../structkinematics_1_1gearpos__t.html#a9389e03d0ec896769bbe7bf3e2673a26',1,'kinematics::gearpos_t::vec()'],['../structkinematics_1_1jointpos__t.html#a1c3501bdc6b433d9aec164be2467b80b',1,'kinematics::jointpos_t::vec()']]], - ['vec_154',['Vec',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'cv::Vec::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'cv::Vec::Vec(_Tp v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'cv::Vec::Vec(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'cv::Vec::Vec(const _Tp *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'cv::Vec::Vec(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'cv::Vec::Vec(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'cv::Vec::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'cv::Vec::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'cv::Vec::Vec(const Matx< _Tp, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< _Tp, 4 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< _Tp, 4 >::Vec(_Tp v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< _Tp, 4 >::Vec(const _Tp *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< _Tp, 4 >::Vec(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< _Tp, 4 >::Vec(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< _Tp, 4 >::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< _Tp, 4 >::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< _Tp, 4 >::Vec(const Matx< _Tp, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, 2 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, 2 >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, 2 >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, 2 >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, 2 >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, 2 >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, 2 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, 2 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, 2 >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, 3 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, 3 >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, 3 >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, 3 >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, 3 >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, 3 >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, 3 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, 3 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, 3 >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, 4 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, 4 >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, 4 >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, 4 >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, 4 >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, 4 >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, 4 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, 4 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, 4 >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, nFeatures >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, nFeatures >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, nFeatures >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, nFeatures >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, nFeatures >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, nFeatures >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, nFeatures >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< float, 2 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< float, 2 >::Vec(float v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< float, 2 >::Vec(float v0, float v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< float, 2 >::Vec(const float *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< float, 2 >::Vec(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< float, 2 >::Vec(const Vec< float, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< float, 2 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< float, 2 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< float, 2 >::Vec(const Matx< float, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< float, 3 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< float, 3 >::Vec(float v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< float, 3 >::Vec(float v0, float v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< float, 3 >::Vec(const float *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< float, 3 >::Vec(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< float, 3 >::Vec(const Vec< float, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< float, 3 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< float, 3 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< float, 3 >::Vec(const Matx< float, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)']]], + ['vec_153',['Vec',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'cv::Vec::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'cv::Vec::Vec(_Tp v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'cv::Vec::Vec(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'cv::Vec::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'cv::Vec::Vec(const _Tp *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'cv::Vec::Vec(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'cv::Vec::Vec(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'cv::Vec::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'cv::Vec::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'cv::Vec::Vec(const Matx< _Tp, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< _Tp, 4 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< _Tp, 4 >::Vec(_Tp v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< _Tp, 4 >::Vec(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< _Tp, 4 >::Vec(const _Tp *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< _Tp, 4 >::Vec(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< _Tp, 4 >::Vec(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< _Tp, 4 >::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< _Tp, 4 >::Vec(const Matx< _Tp, cn, 1 > &a, const Matx< _Tp, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< _Tp, 4 >::Vec(const Matx< _Tp, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, 2 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, 2 >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, 2 >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, 2 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, 2 >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, 2 >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, 2 >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, 2 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, 2 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, 2 >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, 3 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, 3 >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, 3 >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, 3 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, 3 >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, 3 >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, 3 >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, 3 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, 3 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, 3 >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, 4 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, 4 >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, 4 >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, 4 >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, 4 >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, 4 >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, 4 >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, 4 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, 4 >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, 4 >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, GPCPatchDescriptor::nFeatures >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< double, nFeatures >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< double, nFeatures >::Vec(double v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< double, nFeatures >::Vec(double v0, double v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< double, nFeatures >::Vec(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< double, nFeatures >::Vec(const double *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< double, nFeatures >::Vec(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< double, nFeatures >::Vec(const Vec< double, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< double, nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< double, nFeatures >::Vec(const Matx< double, cn, 1 > &a, const Matx< double, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< double, nFeatures >::Vec(const Matx< double, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< float, 2 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< float, 2 >::Vec(float v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< float, 2 >::Vec(float v0, float v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< float, 2 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< float, 2 >::Vec(const float *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< float, 2 >::Vec(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< float, 2 >::Vec(const Vec< float, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< float, 2 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< float, 2 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< float, 2 >::Vec(const Matx< float, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72bcb5232e9c11542886319edb9809a9',1,'Vec< float, 3 >::Vec()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a70931c51a1f6c84bc8f1863b8f35fadc',1,'Vec< float, 3 >::Vec(float v0)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab3c6059e273514f79aebefc2825ea06c',1,'Vec< float, 3 >::Vec(float v0, float v1)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a72280b48a5d716939114289dc0930ba6',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4860aebf83282553be32c021cf9726bc',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae50afd23b21fbd313dbfc8476db849b2',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a841ae2e0076c9393b42baee62f1ddafc',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a78a6c4b0bd6932de02c191365a4e7d87',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af133aa5b6e162a522a72a999a7130786',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a25667a57fe49571f285bf5b65e8e76d0',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a74ba63687a0a3878d9a3ded1e0990622',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ad3ca0d42d33d8c567a13583e7bec56b8',1,'Vec< float, 3 >::Vec(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae18d706f80604c0ff965ae3e0990133b',1,'Vec< float, 3 >::Vec(const float *values)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a75d9d5f91cbdccc4d23a0be648defab6',1,'Vec< float, 3 >::Vec(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a2bcc2be2e6fc71d00a03f109e445f86b',1,'Vec< float, 3 >::Vec(const Vec< float, cn > &v)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7fd8306c05b9acc8a29b8c9aed9e862e',1,'Vec< float, 3 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aad44e28ea1f8406e959b5e9f775f8bae',1,'Vec< float, 3 >::Vec(const Matx< float, cn, 1 > &a, const Matx< float, cn, 1 > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afee660de3dc97a440b310e7dada5cb92',1,'Vec< float, 3 >::Vec(const Matx< float, cn, 1 > &a, _T2 alpha, Matx_ScaleOp)']]], + ['vec_154',['vec',['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'Eigen::QuaternionBase::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'Eigen::QuaternionBase::vec() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::vec() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::vec() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a91f93bde88f52796cfcd92c3594f39e5',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::vec()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ada8bdb403471df23511bdc0f227962ea',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::vec() const'],['../structkinematics_1_1gearpos__t.html#a9389e03d0ec896769bbe7bf3e2673a26',1,'kinematics::gearpos_t::vec()'],['../structkinematics_1_1jointpos__t.html#a1c3501bdc6b433d9aec164be2467b80b',1,'kinematics::jointpos_t::vec()']]], ['veccommainitializer_155',['VecCommaInitializer',['https://docs.opencv.org/4.2.0/d1/d3e/classcv_1_1VecCommaInitializer.html#ac5bdd3d3be05ff80a551f7394bad57fe',1,'cv::VecCommaInitializer']]], ['veclen_156',['veclen',['https://docs.opencv.org/4.2.0/db/d18/classcv_1_1flann_1_1GenericIndex.html#a51e8e412d2743612d626d4280ad9483d',1,'cv::flann::GenericIndex']]], ['vecoptypetostr_157',['vecopTypeToStr',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga87fc1246a42a1f4c46eeea3ad5ce1790',1,'cv::ocl::vecopTypeToStr()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga87fc1246a42a1f4c46eeea3ad5ce1790',1,'vecopTypeToStr()(Global Namespace)']]], diff --git a/search/functions_1b.js b/search/functions_1b.js index 5ac70342..7d397536 100644 --- a/search/functions_1b.js +++ b/search/functions_1b.js @@ -134,8 +134,8 @@ var searchData= ['_7elist_131',['~list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a6520eeff66a82d7b6e5eacffdcb2da6e',1,'list< __inp, __rebind_inp >::~list()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a6520eeff66a82d7b6e5eacffdcb2da6e',1,'std::list::~list()']]], ['_7elocale_132',['~locale',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a45b12cb443002d7995d5a1fd4d2ad179',1,'std::locale']]], ['_7elock_5fguard_133',['~lock_guard',['https://docs.opencv.org/4.2.0/de/d29/classcv_1_1utils_1_1lock__guard.html#afb8ed8974c3f3a9fd2ac3e092619c17d',1,'cv::utils::lock_guard']]], - ['_7emap_134',['~map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a2460e7e43dc674a1cb696c4eb1985b5e',1,'std::map']]], - ['_7emap_135',['~Map',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html#afaab55825ddfaf5a44de8d8ae69d92e8',1,'cv::reg::Map::~Map()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01SparseMatrixType_01_4.html#aefb5ce85ff8508d6a035b1b72158ca83',1,'Eigen::Map< SparseMatrixType >::~Map()']]], + ['_7emap_134',['~Map',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1reg_1_1Map.html#afaab55825ddfaf5a44de8d8ae69d92e8',1,'cv::reg::Map::~Map()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Map_3_01SparseMatrixType_01_4.html#aefb5ce85ff8508d6a035b1b72158ca83',1,'Eigen::Map< SparseMatrixType >::~Map()']]], + ['_7emap_135',['~map',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a2460e7e43dc674a1cb696c4eb1985b5e',1,'std::map']]], ['_7emapaffine_136',['~MapAffine',['https://docs.opencv.org/4.2.0/d9/de5/classcv_1_1reg_1_1MapAffine.html#ab62885a2fcb44dbd54cc11bf29f6b5ff',1,'cv::reg::MapAffine']]], ['_7emappedsparsematrix_137',['~MappedSparseMatrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1MappedSparseMatrix.html#a0c36a53853f1659ea59447bcb9a20799',1,'Eigen::MappedSparseMatrix::~MappedSparseMatrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MappedSparseMatrix.html#a0c36a53853f1659ea59447bcb9a20799',1,'MappedSparseMatrix< Scalar, ColMajor, StorageIndex >::~MappedSparseMatrix()']]], ['_7emapper_138',['~Mapper',['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1reg_1_1Mapper.html#a81420438917d1adeb2395083a087c7bb',1,'cv::reg::Mapper']]], diff --git a/search/functions_3.js b/search/functions_3.js index 01c69bf5..fae39963 100644 --- a/search/functions_3.js +++ b/search/functions_3.js @@ -164,8 +164,8 @@ var searchData= ['colormatchtemplate_161',['colorMatchTemplate',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga370f180e4a52231ba218adbb4a65a9ca',1,'cv::ximgproc::colorMatchTemplate()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga370f180e4a52231ba218adbb4a65a9ca',1,'colorMatchTemplate()(Global Namespace)']]], ['colormomenthash_162',['ColorMomentHash',['https://docs.opencv.org/4.2.0/df/d52/classcv_1_1img__hash_1_1ColorMomentHash.html#a5f541f69c95426c6f220fef2f88d47c5',1,'cv::img_hash::ColorMomentHash']]], ['colormomenthash_163',['colorMomentHash',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gac2b55a4cec31a709cee9f9cdd6b933f7',1,'cv::img_hash::colorMomentHash()'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html#gac2b55a4cec31a709cee9f9cdd6b933f7',1,'colorMomentHash()(Global Namespace)']]], - ['colpivhouseholderqr_164',['colPivHouseholderQr',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adee8c19c833245bbb00a591dce68e8a4',1,'Eigen::MatrixBase::colPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adee8c19c833245bbb00a591dce68e8a4',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::colPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adee8c19c833245bbb00a591dce68e8a4',1,'MatrixBase< Solve< Decomposition, RhsType > >::colPivHouseholderQr()']]], - ['colpivhouseholderqr_165',['ColPivHouseholderQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a9d8a92c2a2f0debe5454812372237ed4',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a1aa6a5b95380df0ceb224cb833316d4f',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a65782010a93a4c9ef4a9191ac8fe30bc',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a5965d4fdebc04b2df71d67ff0b2d0c2c',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a9d8a92c2a2f0debe5454812372237ed4',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a1aa6a5b95380df0ceb224cb833316d4f',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a65782010a93a4c9ef4a9191ac8fe30bc',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a5965d4fdebc04b2df71d67ff0b2d0c2c',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR(Index rows, Index cols)']]], + ['colpivhouseholderqr_164',['ColPivHouseholderQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a9d8a92c2a2f0debe5454812372237ed4',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a1aa6a5b95380df0ceb224cb833316d4f',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a65782010a93a4c9ef4a9191ac8fe30bc',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a5965d4fdebc04b2df71d67ff0b2d0c2c',1,'Eigen::ColPivHouseholderQR::ColPivHouseholderQR(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a9d8a92c2a2f0debe5454812372237ed4',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a1aa6a5b95380df0ceb224cb833316d4f',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a65782010a93a4c9ef4a9191ac8fe30bc',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a5965d4fdebc04b2df71d67ff0b2d0c2c',1,'ColPivHouseholderQR< MatrixType >::ColPivHouseholderQR(Index rows, Index cols)']]], + ['colpivhouseholderqr_165',['colPivHouseholderQr',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adee8c19c833245bbb00a591dce68e8a4',1,'Eigen::MatrixBase::colPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adee8c19c833245bbb00a591dce68e8a4',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::colPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#adee8c19c833245bbb00a591dce68e8a4',1,'MatrixBase< Solve< Decomposition, RhsType > >::colPivHouseholderQr()']]], ['colrange_166',['colRange',['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a7256892911593daf1bdefb183d6fd29e',1,'cv::cuda::GpuMat::colRange(int startcol, int endcol) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#acfcbd3a61ca20ec908dc6de76ef6e5bb',1,'cv::cuda::GpuMat::colRange(Range r) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#adb4d4ba56dc63484445f278b25819b90',1,'cv::cudev::GpuMat_::colRange(int startcol, int endcol) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ae3b1cd86db92d50c5776742796ecc8d1',1,'cv::cudev::GpuMat_::colRange(Range r) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aadc8f9210fe4dec50513746c246fa8d9',1,'cv::Mat::colRange(int startcol, int endcol) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#acccb63e44eba6ba81ead99881bd1997e',1,'cv::Mat::colRange(const Range &r) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#adc6ffa253b779dd078638ad996e17c2f',1,'cv::UMat::colRange(int startcol, int endcol) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ade9f05c6bae4f6de8b24cc71d29f4b8a',1,'cv::UMat::colRange(const Range &r) const']]], ['cols_167',['cols',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#abf46b7c02ec98a5b26820f79f7017b03',1,'cv::_InputArray::cols()'],['https://docs.opencv.org/4.2.0/d3/d68/classcv_1_1ogl_1_1Buffer.html#a66fc0bec98329378bdc5303654da5238',1,'cv::ogl::Buffer::cols()'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a125aad6e3dfbc590e12b21c856282003',1,'cv::ogl::Texture2D::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'Eigen::EigenBase::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< BandMatrix< _Scalar, Rows, Cols, Supers, Subs, Options > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< BandMatrix< Scalar, Rows, Cols, Supers, Subs, Options > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Block< XprType, BlockRows, BlockCols, true > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< ColPivHouseholderQR< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< ColPivHouseholderQR< MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< CompleteOrthogonalDecomposition< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< FullPivHouseholderQR< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< FullPivLU< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< HouseholderQR< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< HouseholderSequence< VectorsType, CoeffsType, Side > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Inverse< PermutationType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< LDLT< _MatrixType, _UpLo > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< LLT< _MatrixType, _UpLo > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< PartialPivLU< _MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< PermutationWrapper< _IndicesType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SelfAdjointView< _MatrixType, UpLo > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SelfAdjointView< const Derived, UpLo > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SparseSelfAdjointView< const Derived, _Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SparseSelfAdjointView< MatrixType, _Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SparseSymmetricPermutationProduct< MatrixType, Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SVDBase< Derived > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< Transpose< MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< TriangularView< _MatrixType, _Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/structEigen_1_1EigenBase.html#a2d768a9877f5f69f49432d447b552bfe',1,'EigenBase< TriangularView< MatrixType, Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#a35475457c973a66539417b61449cbf5a',1,'Eigen::HouseholderSequence::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#ac78d2b46d4071963d3cab4a762de6129',1,'Eigen::IncompleteCholesky::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IndexedView.html#a6d5f355dd721df6d39482a04e5ffd44d',1,'Eigen::IndexedView::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#adb0a19af0c52f9f36160abe0d2de67e1',1,'Eigen::MapBase< Derived, ReadOnlyAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'Eigen::PermutationBase::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a26961ef6cfef586d412054ee5a20d430',1,'PermutationBase< PermutationWrapper< _IndicesType > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a0fc44f3781a869a3a410edd6691fd899',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'Eigen::SparseMatrix::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'SparseMatrix< Scalar >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'SparseMatrix< Scalar, ColMajor, int >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#aa391750e3c530227e4a5c3c52e959975',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'Eigen::SparseMatrixBase::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< Transpose< MatrixType > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aca7ce296424ef6e478ab0fb19547a7ee',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a87730dd85f0d77de74bca724d0b21624',1,'Eigen::SparseQR::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#acf75fdb279f16d7c4907118ca3eb69ed',1,'Eigen::SPQR::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a12d7ac8a095cda817cd241f1aae2f8fb',1,'Eigen::TriangularView::cols()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#a12d7ac8a095cda817cd241f1aae2f8fb',1,'TriangularView< const Derived, Mode >::cols()']]], ['colspermutation_168',['colsPermutation',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ab6ad43e6a6fb75726eae0d5499948f4a',1,'Eigen::ColPivHouseholderQR::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#ab6ad43e6a6fb75726eae0d5499948f4a',1,'ColPivHouseholderQR< MatrixType >::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a601c67a4a0bbe9c7b25b885279db9ff2',1,'Eigen::CompleteOrthogonalDecomposition::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#abeda6d91e196c13d4dd8b7542fef3e17',1,'Eigen::FullPivHouseholderQR::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a4b9e6a3c7ee9326e3ae1672a109462f9',1,'Eigen::SparseLU::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a22f63d6baabc4dff27320776d9a1a3a1',1,'Eigen::SparseQR::colsPermutation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a6c4ad8d482dd7f23029c428dbd8e13e9',1,'Eigen::SPQR::colsPermutation()']]], @@ -196,8 +196,8 @@ var searchData= ['completeorthogonaldecomposition_193',['CompleteOrthogonalDecomposition',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a7ba33814fd3fdc62f6179cdcd655c679',1,'Eigen::CompleteOrthogonalDecomposition::CompleteOrthogonalDecomposition()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#afcfaf7a395f853247c23bb52b1ffb1cc',1,'Eigen::CompleteOrthogonalDecomposition::CompleteOrthogonalDecomposition(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a082295ba2aac35a8b8b9e2d46e1d7ce4',1,'Eigen::CompleteOrthogonalDecomposition::CompleteOrthogonalDecomposition(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#aa6c282dd7452ebe754024edb71bebd09',1,'Eigen::CompleteOrthogonalDecomposition::CompleteOrthogonalDecomposition(Index rows, Index cols)']]], ['completeorthogonaldecomposition_194',['completeOrthogonalDecomposition',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae90b6846f05bd30b8d52b66e427e3e09',1,'Eigen::MatrixBase::completeOrthogonalDecomposition()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae90b6846f05bd30b8d52b66e427e3e09',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::completeOrthogonalDecomposition()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae90b6846f05bd30b8d52b66e427e3e09',1,'MatrixBase< Solve< Decomposition, RhsType > >::completeOrthogonalDecomposition()']]], ['completesymm_195',['completeSymm',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6847337c0c55769e115a70e0f011b5ca',1,'cv::completeSymm()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6847337c0c55769e115a70e0f011b5ca',1,'completeSymm()(Global Namespace)']]], - ['complex_196',['complex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a4243bd8ee861d7f2e640127085fb4c48',1,'std::complex::complex(const _Tp &__r=_Tp(), const _Tp &__i=_Tp())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a49d7da00378dd1c3bd5984ffdce09349',1,'std::complex::complex(const complex< _Up > &__z)']]], - ['complex_197',['Complex',['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#af3bec7e8907947043569bf8a366a84f0',1,'cv::Complex::Complex()'],['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#ad7d6fe6d84cff0cd7ad5e46dccdb5c1b',1,'cv::Complex::Complex(_Tp _re, _Tp _im=0)']]], + ['complex_196',['Complex',['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#af3bec7e8907947043569bf8a366a84f0',1,'cv::Complex::Complex()'],['https://docs.opencv.org/4.2.0/da/df6/classcv_1_1Complex.html#ad7d6fe6d84cff0cd7ad5e46dccdb5c1b',1,'cv::Complex::Complex(_Tp _re, _Tp _im=0)']]], + ['complex_197',['complex',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a4243bd8ee861d7f2e640127085fb4c48',1,'std::complex::complex(const _Tp &__r=_Tp(), const _Tp &__i=_Tp())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a49d7da00378dd1c3bd5984ffdce09349',1,'std::complex::complex(const complex< _Up > &__z)']]], ['complexeigensolver_198',['ComplexEigenSolver',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a3322a21574c61eefd450c003515ad802',1,'Eigen::ComplexEigenSolver::ComplexEigenSolver()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a748de5c1e7f730e16421e6d451437600',1,'Eigen::ComplexEigenSolver::ComplexEigenSolver(const EigenBase< InputType > &matrix, bool computeEigenvectors=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexEigenSolver.html#a86751f64ebcd5c554551fb5eaaa02db7',1,'Eigen::ComplexEigenSolver::ComplexEigenSolver(Index size)']]], ['complexschur_199',['ComplexSchur',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a9c92c6e4c33890d2d063c5c8dd22777d',1,'Eigen::ComplexSchur::ComplexSchur(const EigenBase< InputType > &matrix, bool computeU=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#ad707d9978dc36b3b15e460c2a83f4093',1,'Eigen::ComplexSchur::ComplexSchur(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#a9c92c6e4c33890d2d063c5c8dd22777d',1,'ComplexSchur< MatrixType >::ComplexSchur(const EigenBase< InputType > &matrix, bool computeU=true)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#ad707d9978dc36b3b15e460c2a83f4093',1,'ComplexSchur< MatrixType >::ComplexSchur(Index size=RowsAtCompileTime==Dynamic ? 1 :RowsAtCompileTime)']]], ['component_200',['component',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a7fed80561a9b46a1a924ac6cb334ac85',1,'cv::Stitcher']]], diff --git a/search/functions_4.js b/search/functions_4.js index a9632d1b..348ea794 100644 --- a/search/functions_4.js +++ b/search/functions_4.js @@ -91,16 +91,16 @@ var searchData= ['detectmarkers_88',['detectMarkers',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gab9159aa69250d8d3642593e508cb6baa',1,'cv::aruco::detectMarkers()'],['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html#gab9159aa69250d8d3642593e508cb6baa',1,'detectMarkers()(Global Namespace)']]], ['detectmultiscale_89',['detectMultiScale',['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#aa4c96739e441adda5005ae58fd95a5a2',1,'cv::BaseCascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, double scaleFactor, int minNeighbors, int flags, Size minSize, Size maxSize)=0'],['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#a68623391e16daa264f089af99d8d4bbb',1,'cv::BaseCascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, std::vector< int > &numDetections, double scaleFactor, int minNeighbors, int flags, Size minSize, Size maxSize)=0'],['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#afa5ead715ec7c9cf0ef71f210ba7715f',1,'cv::BaseCascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, std::vector< int > &rejectLevels, std::vector< double > &levelWeights, double scaleFactor, int minNeighbors, int flags, Size minSize, Size maxSize, bool outputRejectLevels)=0'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#aaf8181cb63968136476ec4204ffca498',1,'cv::CascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, double scaleFactor=1.1, int minNeighbors=3, int flags=0, Size minSize=Size(), Size maxSize=Size())'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a90fe1b7778bed4a27aa8482e1eecc116',1,'cv::CascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, std::vector< int > &numDetections, double scaleFactor=1.1, int minNeighbors=3, int flags=0, Size minSize=Size(), Size maxSize=Size())'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#accf96d130d9f3cf4c58bf445b7861c19',1,'cv::CascadeClassifier::detectMultiScale(InputArray image, std::vector< Rect > &objects, std::vector< int > &rejectLevels, std::vector< double > &levelWeights, double scaleFactor=1.1, int minNeighbors=3, int flags=0, Size minSize=Size(), Size maxSize=Size(), bool outputRejectLevels=false)'],['https://docs.opencv.org/4.2.0/d9/d80/classcv_1_1cuda_1_1CascadeClassifier.html#a182656b878046eb3f0e9c0f0ee327f08',1,'cv::cuda::CascadeClassifier::detectMultiScale()'],['https://docs.opencv.org/4.2.0/de/da6/classcv_1_1cuda_1_1HOG.html#af4a3bf27a5a04817c6d584d9108f50b7',1,'cv::cuda::HOG::detectMultiScale()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a91e56a2c317392e50fbaa2f5dc78d30b',1,'cv::HOGDescriptor::detectMultiScale(InputArray img, std::vector< Rect > &foundLocations, std::vector< double > &foundWeights, double hitThreshold=0, Size winStride=Size(), Size padding=Size(), double scale=1.05, double finalThreshold=2.0, bool useMeanshiftGrouping=false) const'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a660e5cd036fd5ddf0f5767b352acd948',1,'cv::HOGDescriptor::detectMultiScale(InputArray img, std::vector< Rect > &foundLocations, double hitThreshold=0, Size winStride=Size(), Size padding=Size(), double scale=1.05, double finalThreshold=2.0, bool useMeanshiftGrouping=false) const']]], ['detectmultiscaleroi_90',['detectMultiScaleROI',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a40aabc4ac4dbab3a855ae9182b91ef73',1,'cv::HOGDescriptor']]], - ['detector_91',['detector',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a7d8e71a4a08b41f897151b6ef190c61e',1,'cv::videostab::KeypointBasedMotionEstimator']]], - ['detector_92',['Detector',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a5f60b6ace07d2435f92b6a2353ff5b08',1,'cv::linemod::Detector::Detector()'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#af509761698a542228b047865cc88c996',1,'cv::linemod::Detector::Detector(const std::vector< Ptr< Modality > > &modalities, const std::vector< int > &T_pyramid)'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1Detector.html#a5f1f484e448dc9488dc9643bd6c289ef',1,'cv::Detector::Detector()']]], + ['detector_91',['Detector',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a5f60b6ace07d2435f92b6a2353ff5b08',1,'cv::linemod::Detector::Detector()'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#af509761698a542228b047865cc88c996',1,'cv::linemod::Detector::Detector(const std::vector< Ptr< Modality > > &modalities, const std::vector< int > &T_pyramid)'],['https://docs.opencv.org/4.2.0/de/db6/classcv_1_1Detector.html#a5f1f484e448dc9488dc9643bd6c289ef',1,'cv::Detector::Detector()']]], + ['detector_92',['detector',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a7d8e71a4a08b41f897151b6ef190c61e',1,'cv::videostab::KeypointBasedMotionEstimator']]], ['detectorparameters_93',['DetectorParameters',['https://docs.opencv.org/4.2.0/d1/dcd/structcv_1_1aruco_1_1DetectorParameters.html#a12c71ac3314cb086054c963be50d9eeb',1,'cv::aruco::DetectorParameters']]], ['detectregions_94',['detectRegions',['https://docs.opencv.org/4.2.0/d3/d28/classcv_1_1MSER.html#a49d72a1346413106516a7fc6d95c09bb',1,'cv::MSER::detectRegions()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gac4abe0243775e0d1a871a7d85fde0198',1,'cv::text::detectRegions(InputArray image, const Ptr< ERFilter > &er_filter1, const Ptr< ERFilter > &er_filter2, std::vector< std::vector< Point > > &regions)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gacead6485d0966726892094fc4aaf9dc6',1,'cv::text::detectRegions(InputArray image, const Ptr< ERFilter > &er_filter1, const Ptr< ERFilter > &er_filter2, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const String &filename=String(), float minProbability=(float) 0.5)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gac4abe0243775e0d1a871a7d85fde0198',1,'detectRegions(InputArray image, const Ptr< ERFilter > &er_filter1, const Ptr< ERFilter > &er_filter2, std::vector< std::vector< Point > > &regions)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gacead6485d0966726892094fc4aaf9dc6',1,'detectRegions(InputArray image, const Ptr< ERFilter > &er_filter1, const Ptr< ERFilter > &er_filter2, std::vector< Rect > &groups_rects, int method=ERGROUPING_ORIENTATION_HORIZ, const String &filename=String(), float minProbability=(float) 0.5)(Global Namespace)']]], ['detectresultroi_95',['detectResultRoi',['https://docs.opencv.org/4.2.0/dd/d19/classcv_1_1detail_1_1CylindricalPortraitWarper.html#a7bd422c0430eafe4949be6933e24c7de',1,'cv::detail::CylindricalPortraitWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d3/dd6/classcv_1_1detail_1_1CylindricalWarper.html#aaccd0166c4d8ee1329288aa90bacc2c6',1,'cv::detail::CylindricalWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d9/d77/classcv_1_1detail_1_1PlanePortraitWarper.html#a5da8cdd9f86f09630634953de834852f',1,'cv::detail::PlanePortraitWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d3/d3d/classcv_1_1detail_1_1PlaneWarper.html#a838a61c562086c39c02042892765dd40',1,'cv::detail::PlaneWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'cv::detail::RotationWarperBase::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< CompressedRectilinearPortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< CompressedRectilinearProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< CylindricalPortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< CylindricalProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< FisheyeProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< MercatorProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< PaniniPortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< PaniniProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< PlanePortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< PlaneProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< SphericalPortraitProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< SphericalProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< StereographicProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a4f717b59f6e533d065523aa21511883d',1,'RotationWarperBase< TransverseMercatorProjector >::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d8/d70/classcv_1_1detail_1_1SphericalPortraitWarper.html#ab80c05230879653492a6da365b727658',1,'cv::detail::SphericalPortraitWarper::detectResultRoi()'],['https://docs.opencv.org/4.2.0/d6/dd0/classcv_1_1detail_1_1SphericalWarper.html#ab56a9a30d19d301f6c5cb097144699ef',1,'cv::detail::SphericalWarper::detectResultRoi()']]], ['detectresultroibyborder_96',['detectResultRoiByBorder',['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'cv::detail::RotationWarperBase::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< CompressedRectilinearPortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< CompressedRectilinearProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< CylindricalPortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< CylindricalProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< FisheyeProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< MercatorProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< PaniniPortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< PaniniProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< PlanePortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< PlaneProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< SphericalPortraitProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< SphericalProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< StereographicProjector >::detectResultRoiByBorder()'],['https://docs.opencv.org/4.2.0/d6/d65/classcv_1_1detail_1_1RotationWarperBase.html#a24fcba5b61bb28bde8c68439755e5dbe',1,'RotationWarperBase< TransverseMercatorProjector >::detectResultRoiByBorder()']]], ['detectroi_97',['detectROI',['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a26a3085d2f461f22b98c7b6066f51d3e',1,'cv::HOGDescriptor']]], ['determinant_98',['determinant',['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'Eigen::CholmodBase::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'CholmodBase< _MatrixType, Lower, CholmodDecomposition< _MatrixType, Lower > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLDLT< _MatrixType, Lower > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'CholmodBase< _MatrixType, Lower, CholmodSimplicialLLT< _MatrixType, Lower > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CholmodBase.html#ab4ffb4a9735ad7e81a01d5789ce96547',1,'CholmodBase< _MatrixType, Lower, CholmodSupernodalLLT< _MatrixType, Lower > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a71654e5c60a26407ecccfaa5b34bb0aa',1,'Eigen::FullPivLU::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ad8f77004bb956b603bb43fd2e3c061',1,'Eigen::MatrixBase::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ad8f77004bb956b603bb43fd2e3c061',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a7ad8f77004bb956b603bb43fd2e3c061',1,'MatrixBase< Solve< Decomposition, RhsType > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#a54c3d39c9b46ff485a8d2140b9b23193',1,'Eigen::PartialPivLU::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'Eigen::PermutationBase::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a1fc7a5823544700c2e0795e87f9c6d09',1,'PermutationBase< PermutationWrapper< _IndicesType > >::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a29e14dd450da71659b599ce53c6c0bd1',1,'Eigen::SimplicialLDLT::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a05a34e5f9da53de1205780bd991b310d',1,'Eigen::SimplicialLLT::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a9648e81c2d0264abb5996f75b7e0b569',1,'Eigen::SparseLU::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ab8cd6bfc705c0c05a6755ae7437376f9',1,'Eigen::TriangularView::determinant()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularView.html#ab8cd6bfc705c0c05a6755ae7437376f9',1,'TriangularView< const Derived, Mode >::determinant()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga06b8ec936c3cbc9502d76c7818053b41',1,'cv::determinant(const Matx< _Tp, m, m > &a)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf802bd9ca3e07b8b6170645ef0611d0c',1,'cv::determinant(InputArray mtx)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga06b8ec936c3cbc9502d76c7818053b41',1,'determinant(const Matx< _Tp, m, m > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaf802bd9ca3e07b8b6170645ef0611d0c',1,'determinant(InputArray mtx)(Global Namespace)']]], - ['device_99',['device',['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#adf7dfe6389a254b59e90520ab3c7c4fc',1,'cv::ocl::Context']]], - ['device_100',['Device',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ae14a69abe6d37c41a3a9d32e7e77fded',1,'cv::ocl::Device::Device()'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2aeda46f7bf9502aa3863eee5fc664ea',1,'cv::ocl::Device::Device(void *d)'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0a0cec7084b4e2b942f34709123b734b',1,'cv::ocl::Device::Device(const Device &d)']]], + ['device_99',['Device',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ae14a69abe6d37c41a3a9d32e7e77fded',1,'cv::ocl::Device::Device()'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2aeda46f7bf9502aa3863eee5fc664ea',1,'cv::ocl::Device::Device(void *d)'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0a0cec7084b4e2b942f34709123b734b',1,'cv::ocl::Device::Device(const Device &d)']]], + ['device_100',['device',['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#adf7dfe6389a254b59e90520ab3c7c4fc',1,'cv::ocl::Context']]], ['devicecopyobsolete_101',['deviceCopyObsolete',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a637d69a885ec00d4d69559efb748fa6b',1,'cv::UMatData']]], ['deviceid_102',['deviceID',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ad58f770aa964e967e8dfc5b97913e067',1,'cv::cuda::DeviceInfo']]], ['deviceinfo_103',['DeviceInfo',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a6ca8e4843a1724e7c525cdcd3cd2f936',1,'cv::cuda::DeviceInfo::DeviceInfo()'],['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a41fe9bf431cd452520183c79620e1d94',1,'cv::cuda::DeviceInfo::DeviceInfo(int device_id)']]], diff --git a/search/functions_5.js b/search/functions_5.js index e936775f..733a9aa1 100644 --- a/search/functions_5.js +++ b/search/functions_5.js @@ -155,8 +155,8 @@ var searchData= ['expintl_152',['expintl',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1329130b32328d0666e290ee5931fa4f',1,'std::expintl()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html#ga1329130b32328d0666e290ee5931fa4f',1,'expintl()(Global Namespace)']]], ['expm1_153',['expm1',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ae7cb2544e4e745bc0067fe793e3f2f81',1,'Eigen']]], ['exponential_5fdistribution_154',['exponential_distribution',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a0d648c2fe97f6882eb362331d4fc4be9',1,'std::exponential_distribution::exponential_distribution()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a0da5c22c9ebe44479b181cce576f466e',1,'std::exponential_distribution::exponential_distribution(_RealType __lambda)']]], - ['exposurecompensator_155',['exposureCompensator',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#afc646488ee47f87c743d3ab1e3832b48',1,'cv::Stitcher::exposureCompensator()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ab065fe029bb9b499c4d86c80741d0a2d',1,'cv::Stitcher::exposureCompensator() const']]], - ['exposurecompensator_156',['ExposureCompensator',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#abd2cbffa1c8be33a5740bc7f3f20d037',1,'cv::detail::ExposureCompensator']]], + ['exposurecompensator_155',['ExposureCompensator',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#abd2cbffa1c8be33a5740bc7f3f20d037',1,'cv::detail::ExposureCompensator']]], + ['exposurecompensator_156',['exposureCompensator',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#afc646488ee47f87c743d3ab1e3832b48',1,'cv::Stitcher::exposureCompensator()'],['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#ab065fe029bb9b499c4d86c80741d0a2d',1,'cv::Stitcher::exposureCompensator() const']]], ['extend_157',['extend',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a0ca284f3375f68b9e9aef558cd5bcd37',1,'Eigen::AlignedBox::extend(const AlignedBox &b)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ac252032292dcf60984191e4dd26f0955',1,'Eigen::AlignedBox::extend(const MatrixBase< Derived > &p)']]], ['extendedkalmanfilter_158',['ExtendedKalmanFilter',['../classfilters_1_1ExtendedKalmanFilter.html#afca45e49eb1884f7e801bfea0a015f51',1,'filters::ExtendedKalmanFilter']]], ['extensions_159',['extensions',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a963606957c52e6ca0b58de3f63afa309',1,'cv::ocl::Device']]], diff --git a/search/functions_6.js b/search/functions_6.js index 0533efc7..551a8470 100644 --- a/search/functions_6.js +++ b/search/functions_6.js @@ -50,7 +50,7 @@ var searchData= ['filterspeckles_47',['filterSpeckles',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gabe331f205a6dd7a9aa5db8a38157d25b',1,'cv::filterSpeckles()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gabe331f205a6dd7a9aa5db8a38157d25b',1,'filterSpeckles()(Global Namespace)']]], ['final_5fprobability_5fdist_48',['final_probability_dist',['https://docs.opencv.org/4.2.0/d1/d0a/classcv_1_1dnn__objdetect_1_1InferBbox.html#a77d8731db72035c2e8dd73ee33278de9',1,'cv::dnn_objdetect::InferBbox']]], ['finalize_49',['finalize',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a070e355e782f14f97879f18747fd70fc',1,'cv::dnn::Layer::finalize(const std::vector< Mat * > &input, std::vector< Mat > &output)'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a45db2ad86a84737afa623976a957a7e6',1,'cv::dnn::Layer::finalize(InputArrayOfArrays inputs, OutputArrayOfArrays outputs)'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a0b9321b1c809d7804e602b6a862d2217',1,'cv::dnn::Layer::finalize(const std::vector< Mat > &inputs, std::vector< Mat > &outputs)'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a713fddc29f4cb873ea720a2c034dff48',1,'cv::dnn::Layer::finalize(const std::vector< Mat > &inputs)'],['https://docs.opencv.org/4.2.0/de/d47/classcv_1_1viz_1_1WCloudCollection.html#a97c9516c974908628d799c02dc359030',1,'cv::viz::WCloudCollection::finalize()'],['https://docs.opencv.org/4.2.0/df/d97/classcv_1_1viz_1_1WWidgetMerger.html#a03faf9f0cdd111224cede259033308ee',1,'cv::viz::WWidgetMerger::finalize()']]], - ['finalshow_50',['finalShow',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga06724816aad0970637457645ae60c8ca',1,'cvv::finalShow()'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga06724816aad0970637457645ae60c8ca',1,'cvv::impl::finalShow()']]], + ['finalshow_50',['finalShow',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga06724816aad0970637457645ae60c8ca',1,'finalShow()(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga06724816aad0970637457645ae60c8ca',1,'cvv::finalShow()'],['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html#ga06724816aad0970637457645ae60c8ca',1,'cvv::impl::finalShow()']]], ['find_51',['find',['https://docs.opencv.org/4.2.0/d0/dd5/classcv_1_1detail_1_1DpSeamFinder.html#a7914624907986f7a94dd424209a8a609',1,'cv::detail::DpSeamFinder::find()'],['https://docs.opencv.org/4.2.0/db/dda/classcv_1_1detail_1_1GraphCutSeamFinder.html#aea2fc0865be1d3134b8dde43ae3e9dd4',1,'cv::detail::GraphCutSeamFinder::find()'],['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1detail_1_1NoSeamFinder.html#ad51c7e7563d047c8217d051570518b85',1,'cv::detail::NoSeamFinder::find()'],['https://docs.opencv.org/4.2.0/dd/d00/classcv_1_1detail_1_1PairwiseSeamFinder.html#a8f7dd0036f534991ec6d02a86dc509a4',1,'cv::detail::PairwiseSeamFinder::find()'],['https://docs.opencv.org/4.2.0/d7/d09/classcv_1_1detail_1_1SeamFinder.html#abaf8facb8e4b77cffcc9085997833989',1,'cv::detail::SeamFinder::find()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af31f0f8c0f55db0640aa8081a593f64e',1,'cv::SparseMat::find(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a782dd472d4a859a13dc77fca7e4ef8a6',1,'cv::SparseMat::find(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#aca75a3e5266b78bafcd01dffe75e563d',1,'cv::SparseMat::find(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a6a68ed5f9b65fa36c3d209c0dafa24a8',1,'cv::SparseMat::find(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#af31f0f8c0f55db0640aa8081a593f64e',1,'cv::SparseMat::find(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a782dd472d4a859a13dc77fca7e4ef8a6',1,'cv::SparseMat::find(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#aca75a3e5266b78bafcd01dffe75e563d',1,'cv::SparseMat::find(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a6a68ed5f9b65fa36c3d209c0dafa24a8',1,'cv::SparseMat::find(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/db/d24/classcv_1_1detail_1_1VoronoiSeamFinder.html#a779eced4775e0a2af9e7b7283b0f70f9',1,'cv::detail::VoronoiSeamFinder::find(const std::vector< UMat > &src, const std::vector< Point > &corners, std::vector< UMat > &masks) CV_OVERRIDE'],['https://docs.opencv.org/4.2.0/db/d24/classcv_1_1detail_1_1VoronoiSeamFinder.html#a0e48673f52e0ae578e4f4315590b04e1',1,'cv::detail::VoronoiSeamFinder::find(const std::vector< Size > &size, const std::vector< Point > &corners, std::vector< UMat > &masks)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a1cd14e7fb27530a1859047f74e7262f9',1,'__gnu_cxx::__versa_string::find(const _CharT *__s, size_type __pos, size_type __n) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a68746de47d8142951be577a34bad453f',1,'__gnu_cxx::__versa_string::find(const __versa_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aff1f1c68135474bef1e118d9f90a0624',1,'__gnu_cxx::__versa_string::find(const _CharT *__s, size_type __pos=0) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a68d1fb6f098a29470128421c04605a18',1,'__gnu_cxx::__versa_string::find(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'__gnu_debug::basic_string::find()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< _CharT >::find(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< _CharT >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< _CharT >::find(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< _CharT >::find(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< _CharT, _Traits, _Allocator >::find(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< _CharT, _Traits, _Allocator >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< _CharT, _Traits, _Allocator >::find(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< _CharT, _Traits, _Allocator >::find(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find(const _Elem *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find(const _Elem *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::find(_Elem __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< char >::find(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< char >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< char >::find(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< char >::find(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find(const char *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find(const char *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::find(char __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< char_type, _Traits, _Alloc >::find(const char_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< char_type, _Traits, _Alloc >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< char_type, _Traits, _Alloc >::find(const char_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< char_type, _Traits, _Alloc >::find(char_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'basic_string< value_type >::find(const value_type *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'basic_string< value_type >::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'basic_string< value_type >::find(const value_type *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'basic_string< value_type >::find(value_type __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a2905ece9a19045bd348be9fd2aa01664',1,'std::basic_string::find(const _CharT *__s, size_type __pos, size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a295acb36c3779a550ca1792fef74736e',1,'std::basic_string::find(const basic_string &__str, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a0961886fe945d04554beab21c4f9bc54',1,'std::basic_string::find(const _CharT *__s, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ad22ff0adb9ffcbc5fcbde132fce0898d',1,'std::basic_string::find(_CharT __c, size_type __pos=0) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#abdcd985632d8ad7ddba069aa776e2dfe',1,'std::map::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a39303b5617b240f3049dbb0d195789f5',1,'std::map::find(const _Kt &__x) -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a07cdb0ebaf753ec1244849dbff2ec4cf',1,'std::map::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#accf5f3477b6615f6b31fcb1adf068dfc',1,'std::map::find(const _Kt &__x) const -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#abdcd985632d8ad7ddba069aa776e2dfe',1,'std::map::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a39303b5617b240f3049dbb0d195789f5',1,'std::map::find(const _Kt &__x) -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a07cdb0ebaf753ec1244849dbff2ec4cf',1,'std::map::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#accf5f3477b6615f6b31fcb1adf068dfc',1,'std::map::find(const _Kt &__x) const -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a3ee75438d859fab67b756b7282a9a4d3',1,'std::multimap::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a84c1e49764e53439674b8f7e8baf33d4',1,'std::multimap::find(const _Kt &__x) -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2cef7a0c61ebd047d63d456e73c7167f',1,'std::multimap::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a71793c903d56962b5f25f08ba76e4196',1,'std::multimap::find(const _Kt &__x) const -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a3ee75438d859fab67b756b7282a9a4d3',1,'std::multimap::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a84c1e49764e53439674b8f7e8baf33d4',1,'std::multimap::find(const _Kt &__x) -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a2cef7a0c61ebd047d63d456e73c7167f',1,'std::multimap::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a71793c903d56962b5f25f08ba76e4196',1,'std::multimap::find(const _Kt &__x) const -> decltype(_M_t._M_find_tr(__x))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a88ae213f5272a4de1e360e1e69335d8b',1,'std::multiset::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae1bc7a281212bde2b7b49e3a7589c0cc',1,'std::multiset::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ad558199cc94a4197f0623861bc955f1a',1,'std::multiset::find(const _Kt &__x) -> decltype(iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae3d52c5bfb2c4ae04923e6bd96a01ae7',1,'std::multiset::find(const _Kt &__x) const -> decltype(const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a88ae213f5272a4de1e360e1e69335d8b',1,'std::multiset::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae1bc7a281212bde2b7b49e3a7589c0cc',1,'std::multiset::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ad558199cc94a4197f0623861bc955f1a',1,'std::multiset::find(const _Kt &__x) -> decltype(iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae3d52c5bfb2c4ae04923e6bd96a01ae7',1,'std::multiset::find(const _Kt &__x) const -> decltype(const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af20eddb69820079242b06871210f9b06',1,'std::set::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af9b85bc6147d2b93a7a470ab20baab1a',1,'std::set::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a70c1741d5e747b2b0a3ae6217fc5906d',1,'std::set::find(const _Kt &__x) -> decltype(iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ac46165e1a88cdf7f318309c2c35f028d',1,'std::set::find(const _Kt &__x) const -> decltype(const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af20eddb69820079242b06871210f9b06',1,'std::set::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#af9b85bc6147d2b93a7a470ab20baab1a',1,'std::set::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a70c1741d5e747b2b0a3ae6217fc5906d',1,'std::set::find(const _Kt &__x) -> decltype(iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#ac46165e1a88cdf7f318309c2c35f028d',1,'std::set::find(const _Kt &__x) const -> decltype(const_iterator'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ad62fc2387c4fa4aefe228c14239f8c40',1,'std::unordered_map::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a589217c1b2ed3f77f57aeb41d5192d0d',1,'std::unordered_map::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ad62fc2387c4fa4aefe228c14239f8c40',1,'std::unordered_map::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a589217c1b2ed3f77f57aeb41d5192d0d',1,'std::unordered_map::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a9f64e8fbc46b2fec76e96499ac91c8b6',1,'std::unordered_multimap::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a3a54562ef76d4966a496b86691fdfb12',1,'std::unordered_multimap::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a9f64e8fbc46b2fec76e96499ac91c8b6',1,'std::unordered_multimap::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a3a54562ef76d4966a496b86691fdfb12',1,'std::unordered_multimap::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a3abb4ae4616bf85eb3201d4488007420',1,'std::unordered_multiset::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af99eeb8286c1266dba2e9155f8efe0b6',1,'std::unordered_multiset::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a3abb4ae4616bf85eb3201d4488007420',1,'std::unordered_multiset::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af99eeb8286c1266dba2e9155f8efe0b6',1,'std::unordered_multiset::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#af673d30d52e825e4f8da4c8770f0589b',1,'std::unordered_set::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a1f05b3fd1a72e6b246b0e5ce8d0937cf',1,'std::unordered_set::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#af673d30d52e825e4f8da4c8770f0589b',1,'std::unordered_set::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a1f05b3fd1a72e6b246b0e5ce8d0937cf',1,'std::unordered_set::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ad62fc2387c4fa4aefe228c14239f8c40',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a589217c1b2ed3f77f57aeb41d5192d0d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::find(const key_type &__x) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ad62fc2387c4fa4aefe228c14239f8c40',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::find(const key_type &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a589217c1b2ed3f77f57aeb41d5192d0d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::find(const key_type &__x) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_acdf9b3aab82dcf443dd91ca5ec06b80c.html#acdf9b3aab82dcf443dd91ca5ec06b80c',1,'nlohmann::basic_json::find(KeyT &&key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a17a516671c29a69bb2e11ca12030316b.html#a17a516671c29a69bb2e11ca12030316b',1,'nlohmann::basic_json::find(KeyT &&key) const'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a2486527ac56e07d58946ae9a93a46bc8.html#a2486527ac56e07d58946ae9a93a46bc8',1,'nlohmann::ordered_map::find(const Key &key)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a41e6e34fa8a90b96cbe5c71fec10d2ee.html#a41e6e34fa8a90b96cbe5c71fec10d2ee',1,'nlohmann::ordered_map::find(const Key &key) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga346cc7c0b794d9a487a11b44b6b238ab',1,'std::find()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga346cc7c0b794d9a487a11b44b6b238ab',1,'find()(Global Namespace)']]], ['find4quadcornersubpix_52',['find4QuadCornerSubpix',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gab8816c8a176e1d78893b843b3f01557a',1,'cv::find4QuadCornerSubpix()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#gab8816c8a176e1d78893b843b3f01557a',1,'find4QuadCornerSubpix()(Global Namespace)']]], ['find_5fby_5forder_53',['find_by_order',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#a514976f742b56de21e6672e674ab62f5',1,'__gnu_pbds::tree_order_statistics_node_update::find_by_order(size_type) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#ac8200dc2f6a2b071509c9a817bc48248',1,'__gnu_pbds::tree_order_statistics_node_update::find_by_order(size_type)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#ae110b0862e2ece5ba1e6c35c4ac4e2a6',1,'__gnu_pbds::trie_order_statistics_node_update::find_by_order(size_type) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#a635c02fe43bd67dd830531d387e9467c',1,'__gnu_pbds::trie_order_statistics_node_update::find_by_order(size_type)']]], @@ -178,10 +178,10 @@ var searchData= ['ft12d_5fpolynomial_175',['FT12D_polynomial',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga3ac09befbc2b08c59cc9a60dbe3fdcca',1,'cv::ft::FT12D_polynomial()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga3ac09befbc2b08c59cc9a60dbe3fdcca',1,'FT12D_polynomial()(Global Namespace)']]], ['ft12d_5fprocess_176',['FT12D_process',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga7a49b37ec6f442427b9a3ef4842189dd',1,'cv::ft::FT12D_process()'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html#ga7a49b37ec6f442427b9a3ef4842189dd',1,'FT12D_process()(Global Namespace)']]], ['ftext_177',['FText',['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#aefc774a9d79c312a0057797220b247b2',1,'cv::gapi::wip::draw::FText']]], - ['fullpivhouseholderqr_178',['fullPivHouseholderQr',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a863bc0e06b641a089508eabec6835ab2',1,'Eigen::MatrixBase::fullPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a863bc0e06b641a089508eabec6835ab2',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::fullPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a863bc0e06b641a089508eabec6835ab2',1,'MatrixBase< Solve< Decomposition, RhsType > >::fullPivHouseholderQr()']]], - ['fullpivhouseholderqr_179',['FullPivHouseholderQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aeb14b4c1eef33128207b40a00bd0bd08',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aeeace3abca6b215025e94c3e098b0a97',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#ac9bdb4f7fa77c1aa16f238592c248e70',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#abf722e1dc7241a5d6f76460ef0c87821',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR(Index rows, Index cols)']]], - ['fullpivlu_180',['fullPivLu',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a25da97d31acab0ee5d9d13bdbb0569da',1,'Eigen::MatrixBase::fullPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a25da97d31acab0ee5d9d13bdbb0569da',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::fullPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a25da97d31acab0ee5d9d13bdbb0569da',1,'MatrixBase< Solve< Decomposition, RhsType > >::fullPivLu()']]], - ['fullpivlu_181',['FullPivLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#af225528d1c6e623a2b1dce091907d13e',1,'Eigen::FullPivLU::FullPivLU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a31a6a984478a9f721f367667fe4c5ab1',1,'Eigen::FullPivLU::FullPivLU(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a3e903b9f401e3fc5d1ca7c6951c76185',1,'Eigen::FullPivLU::FullPivLU(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#ae83ebd2a24088f04e3ac835b0dc001e1',1,'Eigen::FullPivLU::FullPivLU(Index rows, Index cols)']]], + ['fullpivhouseholderqr_178',['FullPivHouseholderQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aeb14b4c1eef33128207b40a00bd0bd08',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aeeace3abca6b215025e94c3e098b0a97',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#ac9bdb4f7fa77c1aa16f238592c248e70',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#abf722e1dc7241a5d6f76460ef0c87821',1,'Eigen::FullPivHouseholderQR::FullPivHouseholderQR(Index rows, Index cols)']]], + ['fullpivhouseholderqr_179',['fullPivHouseholderQr',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a863bc0e06b641a089508eabec6835ab2',1,'Eigen::MatrixBase::fullPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a863bc0e06b641a089508eabec6835ab2',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::fullPivHouseholderQr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a863bc0e06b641a089508eabec6835ab2',1,'MatrixBase< Solve< Decomposition, RhsType > >::fullPivHouseholderQr()']]], + ['fullpivlu_180',['FullPivLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#af225528d1c6e623a2b1dce091907d13e',1,'Eigen::FullPivLU::FullPivLU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a31a6a984478a9f721f367667fe4c5ab1',1,'Eigen::FullPivLU::FullPivLU(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a3e903b9f401e3fc5d1ca7c6951c76185',1,'Eigen::FullPivLU::FullPivLU(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#ae83ebd2a24088f04e3ac835b0dc001e1',1,'Eigen::FullPivLU::FullPivLU(Index rows, Index cols)']]], + ['fullpivlu_181',['fullPivLu',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a25da97d31acab0ee5d9d13bdbb0569da',1,'Eigen::MatrixBase::fullPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a25da97d31acab0ee5d9d13bdbb0569da',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::fullPivLu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a25da97d31acab0ee5d9d13bdbb0569da',1,'MatrixBase< Solve< Decomposition, RhsType > >::fullPivLu()']]], ['function_182',['function',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#aabc5bfd9d463ca6a06aa8198a1f12e14',1,'std::function< _Res(_ArgTypes...)>::function() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a4a3d52a1f71572613d699d0593479615',1,'std::function< _Res(_ArgTypes...)>::function(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a8869fed86e489fcedbf59cd814f440b3',1,'std::function< _Res(_ArgTypes...)>::function(const function &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a91f39c85ac536220f5efd7e505fc73e6',1,'std::function< _Res(_ArgTypes...)>::function(function &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a8c5a08fdc36581c53fa597667322cf7d',1,'std::function< _Res(_ArgTypes...)>::function(_Functor)']]], ['functor_183',['functor',['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseBinaryOp.html#adfb40100689f5e13be1786db5d7fecbf',1,'Eigen::CwiseBinaryOp::functor()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseNullaryOp.html#afef9c2479e357786e4c92da1aa625248',1,'Eigen::CwiseNullaryOp::functor()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseTernaryOp.html#a9009f896ee1103c8f28a748e59f12b9a',1,'Eigen::CwiseTernaryOp::functor()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseUnaryOp.html#aa70041dd94ec46f330cf19a06425d172',1,'Eigen::CwiseUnaryOp::functor()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CwiseUnaryView.html#af01271cdadcbcf195b5d3130ff2e1a48',1,'Eigen::CwiseUnaryView::functor()']]], ['fundamentalfromcorrespondences7pointrobust_184',['fundamentalFromCorrespondences7PointRobust',['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html#ga1d908603423af0d26be144fd233067c1',1,'cv::sfm::fundamentalFromCorrespondences7PointRobust()'],['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html#ga1d908603423af0d26be144fd233067c1',1,'fundamentalFromCorrespondences7PointRobust()(Global Namespace)']]], diff --git a/search/functions_7.js b/search/functions_7.js index cffe626c..0103abfc 100644 --- a/search/functions_7.js +++ b/search/functions_7.js @@ -12,8 +12,8 @@ var searchData= ['gather_9',['gather',['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a1b5d6a81bfbf9135c75babed35ad68ff',1,'cv::TLSDataAccumulator::gather()'],['https://docs.opencv.org/4.2.0/dc/d6e/classcv_1_1TLSDataAccumulator.html#a1b5d6a81bfbf9135c75babed35ad68ff',1,'TLSDataAccumulator< cv::instr::NodeDataTls >::gather()']]], ['gatherdata_10',['gatherData',['https://docs.opencv.org/4.2.0/df/d21/classcv_1_1TLSDataContainer.html#a4a994d1b68e3b63526b7f131f193af4f',1,'cv::TLSDataContainer']]], ['gaussian_11',['gaussian',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a8df8ce4dc7d15916cee743e5a884639d',1,'cv::RNG']]], - ['gaussianblur_12',['gaussianBlur',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaaca00b81d171421032917e53751ac427',1,'cv::gapi::gaussianBlur()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaaca00b81d171421032917e53751ac427',1,'gaussianBlur()(Global Namespace)']]], - ['gaussianblur_13',['GaussianBlur',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaabe8c836e97159a9193fb0b11ac52cf1',1,'cv::GaussianBlur()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaabe8c836e97159a9193fb0b11ac52cf1',1,'GaussianBlur()(Global Namespace)']]], + ['gaussianblur_12',['GaussianBlur',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaabe8c836e97159a9193fb0b11ac52cf1',1,'cv::GaussianBlur()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#gaabe8c836e97159a9193fb0b11ac52cf1',1,'GaussianBlur()(Global Namespace)']]], + ['gaussianblur_13',['gaussianBlur',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaaca00b81d171421032917e53751ac427',1,'cv::gapi::gaussianBlur()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#gaaca00b81d171421032917e53751ac427',1,'gaussianBlur()(Global Namespace)']]], ['gaussianmotionfilter_14',['GaussianMotionFilter',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#gab213d5ccfc50909eace156ca0102c162',1,'cv::videostab::GaussianMotionFilter::GaussianMotionFilter()'],['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html#gab213d5ccfc50909eace156ca0102c162',1,'GaussianMotionFilter()(Global Namespace)']]], ['gbackend_15',['GBackend',['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html#a6e032dfa3f2273017aa6a93fbb56a2c5',1,'cv::gapi::GBackend::GBackend()'],['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html#a5adf4621dcbaf0d8ac438f1c160ce258',1,'cv::gapi::GBackend::GBackend(std::shared_ptr< Priv > &&p)']]], ['gbump_16',['gbump',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'__gnu_cxx::enc_filebuf::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'__gnu_cxx::stdio_filebuf::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'__gnu_cxx::stdio_sync_filebuf::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'basic_filebuf< char_type, traits_type >::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'basic_streambuf< _Elem, _Tr >::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'basic_streambuf< char, _Traits >::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'basic_streambuf< char, char_traits< char > >::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'std::basic_filebuf::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'std::basic_streambuf::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'std::basic_stringbuf::gbump()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a9d130ff289d2617954156378a79dbdc0',1,'std::wbuffer_convert::gbump()']]], @@ -997,8 +997,8 @@ var searchData= ['getwta_5fk_994',['getWTA_K',['https://docs.opencv.org/4.2.0/db/d95/classcv_1_1ORB.html#a180ae17d3300cf2c619aa240d9b607e5',1,'cv::ORB']]], ['getxi_995',['getXi',['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1GeneralizedHoughGuil.html#ae17b61f123af20e6966e3249b53f000a',1,'cv::GeneralizedHoughGuil']]], ['gfluidkernel_996',['GFluidKernel',['https://docs.opencv.org/4.2.0/d0/dc4/classcv_1_1GFluidKernel.html#a43989c69fb2f587d7fdb3517909a7ccb',1,'cv::GFluidKernel::GFluidKernel()'],['https://docs.opencv.org/4.2.0/d0/dc4/classcv_1_1GFluidKernel.html#a20bc42eb01c8c6144b3e2e542763f800',1,'cv::GFluidKernel::GFluidKernel(Kind k, int l, bool scratch, const F &f, const IS &is, const RS &rs, const B &b, const GW &win)']]], - ['gin_997',['gin',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a4941eb8cbe70b8c7187bc8459af7653b',1,'cv']]], - ['gin_998',['GIn',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a8e40d34081b18c79ba4c3cfb9fd0634f',1,'cv']]], + ['gin_997',['GIn',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a8e40d34081b18c79ba4c3cfb9fd0634f',1,'cv']]], + ['gin_998',['gin',['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a4941eb8cbe70b8c7187bc8459af7653b',1,'cv']]], ['gioprotoargs_999',['GIOProtoArgs',['https://docs.opencv.org/4.2.0/d6/d89/structcv_1_1GIOProtoArgs.html#a06f3a9070fde31af258f1ff16e678141',1,'cv::GIOProtoArgs::GIOProtoArgs(const GProtoArgs &args)'],['https://docs.opencv.org/4.2.0/d6/d89/structcv_1_1GIOProtoArgs.html#a3cb4d34afcd8ae600c0b4c7fcdb815bc',1,'cv::GIOProtoArgs::GIOProtoArgs(GProtoArgs &&args)']]], ['glob_1000',['glob',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf91b7f383218e2d3f760939140942297',1,'cv::glob()'],['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#a4ad0cea222ba9846c8b78afedf5832cf',1,'cv::utils::fs::glob()'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf91b7f383218e2d3f760939140942297',1,'glob()(Global Namespace)']]], ['glob_5frelative_1001',['glob_relative',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#a480c13699a3f91d7416f350d698cbf7e',1,'cv::utils::fs']]], diff --git a/search/functions_9.js b/search/functions_9.js index a8b30f25..8f9c134f 100644 --- a/search/functions_9.js +++ b/search/functions_9.js @@ -17,8 +17,8 @@ var searchData= ['ignore_14',['ignore',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'basic_iostream< char >::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'basic_iostream< char >::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'basic_iostream< char >::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'basic_iostream< char >::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'basic_iostream< char >::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'basic_iostream< char >::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'basic_istream< char >::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'basic_istream< char >::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'basic_istream< char >::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'basic_istream< char >::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'basic_istream< char >::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'basic_istream< char >::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'basic_istream< char, _Traits >::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'basic_istream< char, _Traits >::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'basic_istream< char, _Traits >::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'basic_istream< char, _Traits >::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'basic_istream< char, _Traits >::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'basic_istream< char, _Traits >::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'std::basic_fstream::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'std::basic_fstream::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'std::basic_fstream::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'std::basic_fstream::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'std::basic_fstream::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'std::basic_fstream::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'std::basic_ifstream::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'std::basic_ifstream::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'std::basic_ifstream::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'std::basic_ifstream::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'std::basic_ifstream::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'std::basic_ifstream::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'std::basic_iostream::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'std::basic_iostream::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'std::basic_iostream::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'std::basic_iostream::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'std::basic_iostream::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'std::basic_iostream::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'std::basic_istream::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'std::basic_istream::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'std::basic_istream::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'std::basic_istream::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'std::basic_istream::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'std::basic_istream::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'std::basic_istringstream::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'std::basic_istringstream::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'std::basic_istringstream::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'std::basic_istringstream::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'std::basic_istringstream::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'std::basic_istringstream::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'std::basic_stringstream::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'std::basic_stringstream::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'std::basic_stringstream::ignore()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a38f9c60abe3468fe50c0812a5b635b94',1,'std::basic_stringstream::ignore(streamsize __n, int_type __delim)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbdc1d7d62a2d431ada8a761035b2d42',1,'std::basic_stringstream::ignore(streamsize __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a64f338d738e8de460fa4a2be744cff8f',1,'std::basic_stringstream::ignore()']]], ['illuminationchange_15',['illuminationChange',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gac5025767cf2febd8029d474278e886c7',1,'cv::illuminationChange()'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gac5025767cf2febd8029d474278e886c7',1,'illuminationChange()(Global Namespace)']]], ['imag_16',['imag',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a04d60a3c8a266f63c08e03615c1985c9',1,'Eigen']]], - ['image_17',['image',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a0893985d2dab367baa6e57c6fd0c4956',1,'Eigen::FullPivLU']]], - ['image_18',['Image',['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html#ab9cfd217c05ec962a6f39e685ec05ded',1,'cv::gapi::wip::draw::Image']]], + ['image_17',['Image',['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html#ab9cfd217c05ec962a6f39e685ec05ded',1,'cv::gapi::wip::draw::Image']]], + ['image_18',['image',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a0893985d2dab367baa6e57c6fd0c4956',1,'Eigen::FullPivLU']]], ['image2d_19',['Image2D',['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#aca032d597c124ac6de9fb99651d7dbde',1,'cv::ocl::Image2D::Image2D()'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#add72e2232b399e958dde24794b2ce798',1,'cv::ocl::Image2D::Image2D(const UMat &src, bool norm=false, bool alias=false)'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#a7db0945ce066ef26226773382a177e68',1,'cv::ocl::Image2D::Image2D(const Image2D &i)']]], ['image2dmaxheight_20',['image2DMaxHeight',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0d604ced5333c5d611b3beae76bb9363',1,'cv::ocl::Device']]], ['image2dmaxwidth_21',['image2DMaxWidth',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#af6ceb593795e6993dd8da6ae804eae7f',1,'cv::ocl::Device']]], @@ -244,66 +244,65 @@ var searchData= ['ismemreused_241',['isMemReused',['https://docs.opencv.org/4.2.0/df/d82/classNCVMatrixReuse.html#a6b7494fd1717f56be16c4e25362c7d06',1,'NCVMatrixReuse::isMemReused()'],['https://docs.opencv.org/4.2.0/da/d61/classNCVVectorReuse.html#a6fa6e78e73c0dc61241757d3d96627eb',1,'NCVVectorReuse::isMemReused()']]], ['ismuchsmallerthan_242',['isMuchSmallerThan',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3c4db0c6dd974fa88bbb58b2cf3d5664',1,'Eigen::DenseBase::isMuchSmallerThan(const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adfca6ff4e473f68fbbeabbd03b7504a9',1,'Eigen::DenseBase::isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3c4db0c6dd974fa88bbb58b2cf3d5664',1,'DenseBase< ArrayWrapper< ExpressionType > >::isMuchSmallerThan(const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adfca6ff4e473f68fbbeabbd03b7504a9',1,'DenseBase< ArrayWrapper< ExpressionType > >::isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3c4db0c6dd974fa88bbb58b2cf3d5664',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isMuchSmallerThan(const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adfca6ff4e473f68fbbeabbd03b7504a9',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3c4db0c6dd974fa88bbb58b2cf3d5664',1,'DenseBase< Solve< Decomposition, RhsType > >::isMuchSmallerThan(const DenseBase< OtherDerived > &other, const RealScalar &prec=NumTraits< Scalar >::dummy_precision()) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#adfca6ff4e473f68fbbeabbd03b7504a9',1,'DenseBase< Solve< Decomposition, RhsType > >::isMuchSmallerThan(const typename NumTraits< Scalar >::Real &other, const RealScalar &prec) const']]], ['isnamed_243',['isNamed',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa129964f34bc9c288bdd6195c71f0836',1,'cv::FileNode']]], - ['isnan_244',['isNaN',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae19d8a1b2dd1e0806c7d2de07f82f829',1,'cv::softdouble::isNaN()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5001848e8ce56d145ad32301981a12a9',1,'cv::softfloat::isNaN()']]], - ['isnan_245',['isnan',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a99adfc5178f3fd5488304284388b2a10',1,'Eigen']]], - ['isnan_246',['isNaN',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5001848e8ce56d145ad32301981a12a9',1,]]], - ['isnan_247',['isNan',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac1c740657f322dea194e709414743e81',1,'cv::viz::isNan(float x)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac89eaf4fd08fad1f55e315c0e67acf65',1,'cv::viz::isNan(double x)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga0d937e5774fedecb73ea47652f339a02',1,'cv::viz::isNan(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga1a10dc77396c81df53ad300ea4a426c8',1,'cv::viz::isNan(const Point3_< _Tp > &p)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac1c740657f322dea194e709414743e81',1,'isNan(float x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac89eaf4fd08fad1f55e315c0e67acf65',1,'isNan(double x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga0d937e5774fedecb73ea47652f339a02',1,'isNan(const Vec< _Tp, cn > &v)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga1a10dc77396c81df53ad300ea4a426c8',1,'isNan(const Point3_< _Tp > &p)(Global Namespace)']]], - ['isnd_248',['isND',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a2597ddde56d22b00bc0174978309849b',1,'cv::GMatDesc']]], - ['isnegative_249',['isNegative',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#aabd3e7aebe844034caca4c62dbe9c1eb',1,'Eigen::LDLT']]], - ['isnone_250',['isNone',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a6039b64bf7c1719056f3ef2626d882e1',1,'cv::FileNode']]], - ['isnull_251',['isNull',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a37b401dd265c942c9ef2db1e2b1e56e5',1,'Eigen::AlignedBox']]], - ['isnvidia_252',['isNVidia',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a233ee631d4694cf140100e57a415177b',1,'cv::ocl::Device']]], - ['isoldformatcascade_253',['isOldFormatCascade',['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#aee2b340811fff9aff1770feec7ef7d55',1,'cv::BaseCascadeClassifier::isOldFormatCascade()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a556bdd8738ba96aac07628ec38ff46da',1,'cv::CascadeClassifier::isOldFormatCascade()']]], - ['isones_254',['isOnes',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'Eigen::DenseBase::isOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'DenseBase< ArrayWrapper< ExpressionType > >::isOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'DenseBase< Solve< Decomposition, RhsType > >::isOnes()']]], - ['isopen_255',['isOpen',['../classcam_1_1Camera.html#a3a4e701bebbf1664aaa23f9574dae0fb',1,'cam::Camera::isOpen()'],['../classrobot_1_1types_1_1LimitSwitchData.html#ae5a9ddf4a720f8023c6387646b0f8b67',1,'robot::types::LimitSwitchData::isOpen()']]], - ['isopenclactivated_256',['isOpenCLActivated',['https://docs.opencv.org/4.2.0/d5/d96/namespacecv_1_1ocl.html#a587e0f34249ff186739c8df338402aee',1,'cv::ocl']]], - ['isopened_257',['isOpened',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa952c31f4e632595cd5ac107913f4fd1',1,'cv::FileStorage::isOpened()'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a9d2ca36789e7fcfe7a7be3b328038585',1,'cv::VideoCapture::isOpened()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a9a40803e5f671968ac9efa877c984d75',1,'cv::VideoWriter::isOpened()']]], - ['isopenedstream_258',['isOpenedStream',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a365b87a00227198d5835d65bf09ecc81',1,'cv::AVIWriteContainer']]], - ['isorthogonal_259',['isOrthogonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aefdc8e4e4c156fdd79a21479e75dcd8a',1,'Eigen::MatrixBase::isOrthogonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aefdc8e4e4c156fdd79a21479e75dcd8a',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isOrthogonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aefdc8e4e4c156fdd79a21479e75dcd8a',1,'MatrixBase< Solve< Decomposition, RhsType > >::isOrthogonal()']]], - ['isotropicpreconditionerfrompoints_260',['isotropicPreconditionerFromPoints',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga646945dfd23dd78577c04f98441668eb',1,'cv::sfm::isotropicPreconditionerFromPoints()'],['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga646945dfd23dd78577c04f98441668eb',1,'isotropicPreconditionerFromPoints()(Global Namespace)']]], - ['ispositive_261',['isPositive',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a5e1c6b7ba8d7b82575d6ffdc3bf35bcb',1,'Eigen::LDLT']]], - ['ispossiblematch_262',['isPossibleMatch',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#aaeca71427249a189e35e77066f25fc8b',1,'cv::DescriptorMatcher']]], - ['isprint_263',['isprint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acb62bfd8b68d18e2f7902f6bc953b5be',1,'std']]], - ['ispunct_264',['ispunct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a74f97c8b1d25427e90b431e45bfba150',1,'std']]], - ['isreal_265',['isReal',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a19df895cf4d23414e0872ec4f2ab8f94',1,'cv::dnn::DictValue::isReal()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a2b4bb5e70a940bc5543207387923f5aa',1,'cv::FileNode::isReal()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae37527361b2fd69e3d17167629122fea',1,'cv::Scalar_::isReal()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae37527361b2fd69e3d17167629122fea',1,'Scalar_< double >::isReal()']]], - ['isrightnodeleaf_266',['isRightNodeLeaf',['https://docs.opencv.org/4.2.0/df/d88/structHaarFeatureDescriptor32.html#a91d79fdfbd4c4c2ae53f0d33dd989c6a',1,'HaarFeatureDescriptor32']]], - ['isrightof_267',['isRightOf',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a3330f72eb0ace8a8b6faa43c3f606fdd',1,'cv::Subdiv2D']]], - ['isrlmorphologypossible_268',['isRLMorphologyPossible',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga85ed82296e9e9893dcbaa92b87837019',1,'cv::ximgproc::rl::isRLMorphologyPossible()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga85ed82296e9e9893dcbaa92b87837019',1,'isRLMorphologyPossible()(Global Namespace)']]], - ['isrunning_269',['isRunning',['../classutil_1_1AsyncTask.html#a43503af0b5f2252e5921364b3d6671a2',1,'util::AsyncTask']]], - ['isrunninginternal_270',['isRunningInternal',['../classutil_1_1AsyncTask.html#a20bdfa788fbca27e37507bec70d893ee',1,'util::AsyncTask']]], - ['isseparated_271',['isSeparated',['https://docs.opencv.org/4.2.0/d1/dfd/structcv_1_1optflow_1_1GPCPatchDescriptor.html#a9e2fd040535e62051dc84627edb73d4a',1,'cv::optflow::GPCPatchDescriptor']]], - ['isseq_272',['isSeq',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa2671f0a2a477a9f82d73e1bad1f5158',1,'cv::FileNode::isSeq() const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a0bd9a7a631170b4530417b325340624b',1,'cv::FileNode::isSeq(int flags)']]], - ['isspace_273',['isspace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a1adaf858b8edfbfdfcb64f9f6086827e',1,'std']]], - ['isstring_274',['isString',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a196377ee4f1e9e46de495a73ff85eea8',1,'cv::dnn::DictValue::isString()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#abbc622e50535692d0ca5f2e70589a175',1,'cv::FileNode::isString()']]], - ['issubmatrix_275',['isSubmatrix',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7963ba0ea28fcd0f50e5a9218a1e71ba',1,'cv::_InputArray::isSubmatrix()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ab34367822008627e80e144d7bba3bd70',1,'cv::Mat::isSubmatrix()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#acfba13176eea1e0e3db646a4e7a663a5',1,'cv::UMat::isSubmatrix()']]], - ['issubnormal_276',['isSubnormal',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9f1381799912b9539e1841b9ae2e9ed3',1,'cv::softdouble::isSubnormal()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5420ac5bdd327653ee0b90005c5c2b94',1,'cv::softfloat::isSubnormal()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5420ac5bdd327653ee0b90005c5c2b94',1,'isSubnormal()(Global Namespace)']]], - ['issurjective_277',['isSurjective',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a87a7d06e0b0479e5b56b19c2a4f56365',1,'Eigen::ColPivHouseholderQR::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a87a7d06e0b0479e5b56b19c2a4f56365',1,'ColPivHouseholderQR< MatrixType >::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a53dd287d3e1bbc548595d63880fd51bf',1,'Eigen::CompleteOrthogonalDecomposition::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aa3593db4708ce9079b0bdf219b99f57e',1,'Eigen::FullPivHouseholderQR::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a1f6222875fc3a181ee1544b9b36dfda5',1,'Eigen::FullPivLU::isSurjective()']]], - ['issymmetric_278',['isSymmetric',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a271b0287c4b2ec235504216f80ab0019',1,'Eigen::SparseLU']]], - ['istargetfg_279',['isTargetFg',['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html#a85d78ac41fa09c670af1e25704167a07',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerAdaBoostingTargetState::isTargetFg()'],['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html#aebf8d19315900b0a6ae42a731588eb5d',1,'cv::TrackerStateEstimatorMILBoosting::TrackerMILTargetState::isTargetFg()']]], - ['isthreadsafe_280',['isThreadSafe',['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a0bcd4038054223f4cda9f6c3eb7e7c11',1,'cv::detail::FeaturesMatcher']]], - ['istilted_281',['isTilted',['https://docs.opencv.org/4.2.0/df/d88/structHaarFeatureDescriptor32.html#a0dfa9fddc7a4c99325a2382c493a5111',1,'HaarFeatureDescriptor32']]], - ['istrackforgotten_282',['isTrackForgotten',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a22a40130f88f9f7fc8110d68cbfc96ce',1,'cv::tbm::ITrackerByMatching']]], - ['istrackvalid_283',['isTrackValid',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#ab0934009b83726268d925bd69ffd65f0',1,'cv::tbm::ITrackerByMatching']]], - ['istrained_284',['isTrained',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#aab380b59eb30b50254ef1b804774c4d8',1,'cv::ml::StatModel']]], - ['istream_5fiterator_285',['istream_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07975.html#ad21a77186d51771382af6007e650b33c',1,'std::istream_iterator::istream_iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07975.html#a947cfbb26709a887a3e2b47782d8093f',1,'std::istream_iterator::istream_iterator(istream_type &__s)']]], - ['istreambuf_5fiterator_286',['istreambuf_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a75654a594dd9fd94bcf6712f9c3b8d2c',1,'std::istreambuf_iterator::istreambuf_iterator() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#ac5abfcd042a670b72bdbb2fa3ee0d6f5',1,'std::istreambuf_iterator::istreambuf_iterator(istream_type &__s) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#af53baf53c052a0086f61f54cb4dfa337',1,'std::istreambuf_iterator::istreambuf_iterator(streambuf_type *__s) noexcept']]], - ['isumat_287',['isUMat',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7e1555ee58814435df26535ff9380e2e',1,'cv::_InputArray']]], - ['isumatvector_288',['isUMatVector',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a25688fd401f1f9e1d20f31c7f3c9467e',1,'cv::_InputArray']]], - ['isunitary_289',['isUnitary',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a7ee34ce202cac3eeea9cf20c9e4833',1,'Eigen::MatrixBase::isUnitary()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a7ee34ce202cac3eeea9cf20c9e4833',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isUnitary()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a7ee34ce202cac3eeea9cf20c9e4833',1,'MatrixBase< Solve< Decomposition, RhsType > >::isUnitary()']]], - ['isupper_290',['isupper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a50bacb17f1babb86a1239cdc0cf66089',1,'std']]], - ['isuppertriangular_291',['isUpperTriangular',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aae3ec1660bb4ac584220481c54ab4a64',1,'Eigen::MatrixBase::isUpperTriangular()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aae3ec1660bb4ac584220481c54ab4a64',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isUpperTriangular()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aae3ec1660bb4ac584220481c54ab4a64',1,'MatrixBase< Solve< Decomposition, RhsType > >::isUpperTriangular()']]], - ['isvalid_292',['isValid',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a67e9b5fba7b3a70a03db89484aecceb7',1,'cv::TermCriteria::isValid()'],['../classrobot_1_1types_1_1DataPoint.html#a6b0c843157658cd21cfd94808042cd7c',1,'robot::types::DataPoint::isValid()']]], - ['isvaliddepth_293',['isValidDepth',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaec2aff91f8f0600fb7024f57ca9c52c9',1,'cv::rgbd::isValidDepth(const float &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga34e1c9295a7216be59ca4da67d1f5eed',1,'cv::rgbd::isValidDepth(const double &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga74ef1e077263eb737b6349d3d3158f2f',1,'cv::rgbd::isValidDepth(const short int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gafb08f97f37ed0cda66e4f9c47828a0ff',1,'cv::rgbd::isValidDepth(const unsigned short int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga1d690fd424b88e2933705f641c59ac44',1,'cv::rgbd::isValidDepth(const int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga8821699754cadee8a0f04f0622b673c7',1,'cv::rgbd::isValidDepth(const unsigned int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaec2aff91f8f0600fb7024f57ca9c52c9',1,'isValidDepth(const float &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga34e1c9295a7216be59ca4da67d1f5eed',1,'isValidDepth(const double &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga74ef1e077263eb737b6349d3d3158f2f',1,'isValidDepth(const short int &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gafb08f97f37ed0cda66e4f9c47828a0ff',1,'isValidDepth(const unsigned short int &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga1d690fd424b88e2933705f641c59ac44',1,'isValidDepth(const int &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga8821699754cadee8a0f04f0622b673c7',1,'isValidDepth(const unsigned int &depth)(Global Namespace)']]], - ['isvector_294',['isVector',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#ad9a833a610fa8a02d1f840bd6f213086',1,'cv::_InputArray::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'Eigen::SparseMatrixBase::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< Transpose< MatrixType > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::isVector()']]], - ['isvirtual_295',['isvirtual',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a7380e9400279208cdd04ea836f79df8d',1,'cv::Subdiv2D::Vertex']]], - ['isxdigit_296',['isxdigit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2176db62da3573c57096dfe6c2221cb3',1,'std']]], - ['iszero_297',['isZero',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'Eigen::DenseBase::isZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'DenseBase< ArrayWrapper< ExpressionType > >::isZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'DenseBase< Solve< Decomposition, RhsType > >::isZero()']]], - ['items_298',['items',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a916a6ba75ec7624e9c6c977a52d6fd17.html#a916a6ba75ec7624e9c6c977a52d6fd17',1,'nlohmann::basic_json::items() noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4faaed730a81347f2f01e93f37c73823.html#a4faaed730a81347f2f01e93f37c73823',1,'nlohmann::basic_json::items() const noexcept']]], - ['iter_5fswap_299',['iter_swap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gad93e66478d9a63e5777733be09931388',1,'std::iter_swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gad93e66478d9a63e5777733be09931388',1,'iter_swap()(Global Namespace)']]], - ['iterate_300',['iterate',['https://docs.opencv.org/4.2.0/d5/da0/classcv_1_1ximgproc_1_1SuperpixelLSC.html#a651e84e8a99145df8b560858d1fa070b',1,'cv::ximgproc::SuperpixelLSC::iterate()'],['https://docs.opencv.org/4.2.0/df/d81/classcv_1_1ximgproc_1_1SuperpixelSEEDS.html#afc35736ae52b277a1708b54037598cbb',1,'cv::ximgproc::SuperpixelSEEDS::iterate()'],['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1ximgproc_1_1SuperpixelSLIC.html#add5e65da972e5e00ce1753ea862f380c',1,'cv::ximgproc::SuperpixelSLIC::iterate()']]], - ['iterations_301',['iterations',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#ae778dd098bd5e6655625b20b1e9f15da',1,'Eigen::IterativeSolverBase::iterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#afbecc6d0ab1de42be9db79428da48ab6',1,'Eigen::RealQZ::iterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#afbecc6d0ab1de42be9db79428da48ab6',1,'RealQZ< MatrixType >::iterations()']]], - ['iterativesolverbase_302',['IterativeSolverBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a0922f2be45082690d7734aa6732fc493',1,'Eigen::IterativeSolverBase::IterativeSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a3c68fe3cd929ea1ff8a0d4cbcd65ebad',1,'Eigen::IterativeSolverBase::IterativeSolverBase(const EigenBase< MatrixDerived > &A)']]], - ['iterator_5f_303',['iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a53fb6c07d7d3153087d79ca22c1a8ec0',1,'iterator_::iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a43fbe36e902b02465f9cd20a69cbd9a4',1,'iterator_::iterator_(pointer p_value, PB_DS_GEN_POS pos, PB_DS_CLASS_C_DEC *p_tbl)']]], - ['iterator_5fwrapper_304',['iterator_wrapper',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a22e2e5b0e68d9d7c63be2cada5187259.html#a22e2e5b0e68d9d7c63be2cada5187259',1,'nlohmann::basic_json::iterator_wrapper(reference ref) noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3710ff8c5a1cbedb4f75b700a8962d5c.html#a3710ff8c5a1cbedb4f75b700a8962d5c',1,'nlohmann::basic_json::iterator_wrapper(const_reference ref) noexcept']]], - ['iword_305',['iword',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_ios< char, _Traits >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_iostream< char >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_istream< char >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_istream< char, _Traits >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_ostream< char >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_ostream< char, _Traits >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_fstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ifstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ios::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_iostream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_istream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_istringstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ofstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ostream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ostringstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_stringstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::ios_base::iword()']]] + ['isnan_244',['isNaN',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae19d8a1b2dd1e0806c7d2de07f82f829',1,'cv::softdouble::isNaN()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5001848e8ce56d145ad32301981a12a9',1,'cv::softfloat::isNaN()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5001848e8ce56d145ad32301981a12a9',1,'isNaN()(Global Namespace)']]], + ['isnan_245',['isNan',['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac1c740657f322dea194e709414743e81',1,'cv::viz::isNan(float x)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac89eaf4fd08fad1f55e315c0e67acf65',1,'cv::viz::isNan(double x)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga0d937e5774fedecb73ea47652f339a02',1,'cv::viz::isNan(const Vec< _Tp, cn > &v)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga1a10dc77396c81df53ad300ea4a426c8',1,'cv::viz::isNan(const Point3_< _Tp > &p)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac1c740657f322dea194e709414743e81',1,'isNan(float x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#gac89eaf4fd08fad1f55e315c0e67acf65',1,'isNan(double x)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga0d937e5774fedecb73ea47652f339a02',1,'isNan(const Vec< _Tp, cn > &v)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d1/d19/group__viz.html#ga1a10dc77396c81df53ad300ea4a426c8',1,'isNan(const Point3_< _Tp > &p)(Global Namespace)']]], + ['isnan_246',['isnan',['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a99adfc5178f3fd5488304284388b2a10',1,'Eigen']]], + ['isnd_247',['isND',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a2597ddde56d22b00bc0174978309849b',1,'cv::GMatDesc']]], + ['isnegative_248',['isNegative',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#aabd3e7aebe844034caca4c62dbe9c1eb',1,'Eigen::LDLT']]], + ['isnone_249',['isNone',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a6039b64bf7c1719056f3ef2626d882e1',1,'cv::FileNode']]], + ['isnull_250',['isNull',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a37b401dd265c942c9ef2db1e2b1e56e5',1,'Eigen::AlignedBox']]], + ['isnvidia_251',['isNVidia',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a233ee631d4694cf140100e57a415177b',1,'cv::ocl::Device']]], + ['isoldformatcascade_252',['isOldFormatCascade',['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#aee2b340811fff9aff1770feec7ef7d55',1,'cv::BaseCascadeClassifier::isOldFormatCascade()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a556bdd8738ba96aac07628ec38ff46da',1,'cv::CascadeClassifier::isOldFormatCascade()']]], + ['isones_253',['isOnes',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'Eigen::DenseBase::isOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'DenseBase< ArrayWrapper< ExpressionType > >::isOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isOnes()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa56d6b4477cd3c92a9cf42f4b96e47c2',1,'DenseBase< Solve< Decomposition, RhsType > >::isOnes()']]], + ['isopen_254',['isOpen',['../classcam_1_1Camera.html#a3a4e701bebbf1664aaa23f9574dae0fb',1,'cam::Camera::isOpen()'],['../classrobot_1_1types_1_1LimitSwitchData.html#ae5a9ddf4a720f8023c6387646b0f8b67',1,'robot::types::LimitSwitchData::isOpen()']]], + ['isopenclactivated_255',['isOpenCLActivated',['https://docs.opencv.org/4.2.0/d5/d96/namespacecv_1_1ocl.html#a587e0f34249ff186739c8df338402aee',1,'cv::ocl']]], + ['isopened_256',['isOpened',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa952c31f4e632595cd5ac107913f4fd1',1,'cv::FileStorage::isOpened()'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a9d2ca36789e7fcfe7a7be3b328038585',1,'cv::VideoCapture::isOpened()'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a9a40803e5f671968ac9efa877c984d75',1,'cv::VideoWriter::isOpened()']]], + ['isopenedstream_257',['isOpenedStream',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#a365b87a00227198d5835d65bf09ecc81',1,'cv::AVIWriteContainer']]], + ['isorthogonal_258',['isOrthogonal',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aefdc8e4e4c156fdd79a21479e75dcd8a',1,'Eigen::MatrixBase::isOrthogonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aefdc8e4e4c156fdd79a21479e75dcd8a',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isOrthogonal()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aefdc8e4e4c156fdd79a21479e75dcd8a',1,'MatrixBase< Solve< Decomposition, RhsType > >::isOrthogonal()']]], + ['isotropicpreconditionerfrompoints_259',['isotropicPreconditionerFromPoints',['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga646945dfd23dd78577c04f98441668eb',1,'cv::sfm::isotropicPreconditionerFromPoints()'],['https://docs.opencv.org/4.2.0/da/d8b/group__conditioning.html#ga646945dfd23dd78577c04f98441668eb',1,'isotropicPreconditionerFromPoints()(Global Namespace)']]], + ['ispositive_260',['isPositive',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a5e1c6b7ba8d7b82575d6ffdc3bf35bcb',1,'Eigen::LDLT']]], + ['ispossiblematch_261',['isPossibleMatch',['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#aaeca71427249a189e35e77066f25fc8b',1,'cv::DescriptorMatcher']]], + ['isprint_262',['isprint',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acb62bfd8b68d18e2f7902f6bc953b5be',1,'std']]], + ['ispunct_263',['ispunct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a74f97c8b1d25427e90b431e45bfba150',1,'std']]], + ['isreal_264',['isReal',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a19df895cf4d23414e0872ec4f2ab8f94',1,'cv::dnn::DictValue::isReal()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a2b4bb5e70a940bc5543207387923f5aa',1,'cv::FileNode::isReal()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae37527361b2fd69e3d17167629122fea',1,'cv::Scalar_::isReal()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ae37527361b2fd69e3d17167629122fea',1,'Scalar_< double >::isReal()']]], + ['isrightnodeleaf_265',['isRightNodeLeaf',['https://docs.opencv.org/4.2.0/df/d88/structHaarFeatureDescriptor32.html#a91d79fdfbd4c4c2ae53f0d33dd989c6a',1,'HaarFeatureDescriptor32']]], + ['isrightof_266',['isRightOf',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#a3330f72eb0ace8a8b6faa43c3f606fdd',1,'cv::Subdiv2D']]], + ['isrlmorphologypossible_267',['isRLMorphologyPossible',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga85ed82296e9e9893dcbaa92b87837019',1,'cv::ximgproc::rl::isRLMorphologyPossible()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga85ed82296e9e9893dcbaa92b87837019',1,'isRLMorphologyPossible()(Global Namespace)']]], + ['isrunning_268',['isRunning',['../classutil_1_1AsyncTask.html#a43503af0b5f2252e5921364b3d6671a2',1,'util::AsyncTask']]], + ['isrunninginternal_269',['isRunningInternal',['../classutil_1_1AsyncTask.html#a20bdfa788fbca27e37507bec70d893ee',1,'util::AsyncTask']]], + ['isseparated_270',['isSeparated',['https://docs.opencv.org/4.2.0/d1/dfd/structcv_1_1optflow_1_1GPCPatchDescriptor.html#a9e2fd040535e62051dc84627edb73d4a',1,'cv::optflow::GPCPatchDescriptor']]], + ['isseq_271',['isSeq',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aa2671f0a2a477a9f82d73e1bad1f5158',1,'cv::FileNode::isSeq() const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a0bd9a7a631170b4530417b325340624b',1,'cv::FileNode::isSeq(int flags)']]], + ['isspace_272',['isspace',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a1adaf858b8edfbfdfcb64f9f6086827e',1,'std']]], + ['isstring_273',['isString',['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#a196377ee4f1e9e46de495a73ff85eea8',1,'cv::dnn::DictValue::isString()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#abbc622e50535692d0ca5f2e70589a175',1,'cv::FileNode::isString()']]], + ['issubmatrix_274',['isSubmatrix',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7963ba0ea28fcd0f50e5a9218a1e71ba',1,'cv::_InputArray::isSubmatrix()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ab34367822008627e80e144d7bba3bd70',1,'cv::Mat::isSubmatrix()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#acfba13176eea1e0e3db646a4e7a663a5',1,'cv::UMat::isSubmatrix()']]], + ['issubnormal_275',['isSubnormal',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9f1381799912b9539e1841b9ae2e9ed3',1,'cv::softdouble::isSubnormal()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5420ac5bdd327653ee0b90005c5c2b94',1,'cv::softfloat::isSubnormal()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5420ac5bdd327653ee0b90005c5c2b94',1,'isSubnormal()(Global Namespace)']]], + ['issurjective_276',['isSurjective',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a87a7d06e0b0479e5b56b19c2a4f56365',1,'Eigen::ColPivHouseholderQR::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a87a7d06e0b0479e5b56b19c2a4f56365',1,'ColPivHouseholderQR< MatrixType >::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a53dd287d3e1bbc548595d63880fd51bf',1,'Eigen::CompleteOrthogonalDecomposition::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#aa3593db4708ce9079b0bdf219b99f57e',1,'Eigen::FullPivHouseholderQR::isSurjective()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a1f6222875fc3a181ee1544b9b36dfda5',1,'Eigen::FullPivLU::isSurjective()']]], + ['issymmetric_277',['isSymmetric',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a271b0287c4b2ec235504216f80ab0019',1,'Eigen::SparseLU']]], + ['istargetfg_278',['isTargetFg',['https://docs.opencv.org/4.2.0/d1/dd1/classcv_1_1TrackerStateEstimatorAdaBoosting_1_1TrackerAdaBoostingTargetState.html#a85d78ac41fa09c670af1e25704167a07',1,'cv::TrackerStateEstimatorAdaBoosting::TrackerAdaBoostingTargetState::isTargetFg()'],['https://docs.opencv.org/4.2.0/d8/dd1/classcv_1_1TrackerStateEstimatorMILBoosting_1_1TrackerMILTargetState.html#aebf8d19315900b0a6ae42a731588eb5d',1,'cv::TrackerStateEstimatorMILBoosting::TrackerMILTargetState::isTargetFg()']]], + ['isthreadsafe_279',['isThreadSafe',['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a0bcd4038054223f4cda9f6c3eb7e7c11',1,'cv::detail::FeaturesMatcher']]], + ['istilted_280',['isTilted',['https://docs.opencv.org/4.2.0/df/d88/structHaarFeatureDescriptor32.html#a0dfa9fddc7a4c99325a2382c493a5111',1,'HaarFeatureDescriptor32']]], + ['istrackforgotten_281',['isTrackForgotten',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#a22a40130f88f9f7fc8110d68cbfc96ce',1,'cv::tbm::ITrackerByMatching']]], + ['istrackvalid_282',['isTrackValid',['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1tbm_1_1ITrackerByMatching.html#ab0934009b83726268d925bd69ffd65f0',1,'cv::tbm::ITrackerByMatching']]], + ['istrained_283',['isTrained',['https://docs.opencv.org/4.2.0/db/d7d/classcv_1_1ml_1_1StatModel.html#aab380b59eb30b50254ef1b804774c4d8',1,'cv::ml::StatModel']]], + ['istream_5fiterator_284',['istream_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07975.html#ad21a77186d51771382af6007e650b33c',1,'std::istream_iterator::istream_iterator()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07975.html#a947cfbb26709a887a3e2b47782d8093f',1,'std::istream_iterator::istream_iterator(istream_type &__s)']]], + ['istreambuf_5fiterator_285',['istreambuf_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a75654a594dd9fd94bcf6712f9c3b8d2c',1,'std::istreambuf_iterator::istreambuf_iterator() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#ac5abfcd042a670b72bdbb2fa3ee0d6f5',1,'std::istreambuf_iterator::istreambuf_iterator(istream_type &__s) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#af53baf53c052a0086f61f54cb4dfa337',1,'std::istreambuf_iterator::istreambuf_iterator(streambuf_type *__s) noexcept']]], + ['isumat_286',['isUMat',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a7e1555ee58814435df26535ff9380e2e',1,'cv::_InputArray']]], + ['isumatvector_287',['isUMatVector',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a25688fd401f1f9e1d20f31c7f3c9467e',1,'cv::_InputArray']]], + ['isunitary_288',['isUnitary',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a7ee34ce202cac3eeea9cf20c9e4833',1,'Eigen::MatrixBase::isUnitary()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a7ee34ce202cac3eeea9cf20c9e4833',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isUnitary()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a8a7ee34ce202cac3eeea9cf20c9e4833',1,'MatrixBase< Solve< Decomposition, RhsType > >::isUnitary()']]], + ['isupper_289',['isupper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a50bacb17f1babb86a1239cdc0cf66089',1,'std']]], + ['isuppertriangular_290',['isUpperTriangular',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aae3ec1660bb4ac584220481c54ab4a64',1,'Eigen::MatrixBase::isUpperTriangular()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aae3ec1660bb4ac584220481c54ab4a64',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::isUpperTriangular()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#aae3ec1660bb4ac584220481c54ab4a64',1,'MatrixBase< Solve< Decomposition, RhsType > >::isUpperTriangular()']]], + ['isvalid_291',['isValid',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a67e9b5fba7b3a70a03db89484aecceb7',1,'cv::TermCriteria::isValid()'],['../classrobot_1_1types_1_1DataPoint.html#a6b0c843157658cd21cfd94808042cd7c',1,'robot::types::DataPoint::isValid()']]], + ['isvaliddepth_292',['isValidDepth',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaec2aff91f8f0600fb7024f57ca9c52c9',1,'cv::rgbd::isValidDepth(const float &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga34e1c9295a7216be59ca4da67d1f5eed',1,'cv::rgbd::isValidDepth(const double &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga74ef1e077263eb737b6349d3d3158f2f',1,'cv::rgbd::isValidDepth(const short int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gafb08f97f37ed0cda66e4f9c47828a0ff',1,'cv::rgbd::isValidDepth(const unsigned short int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga1d690fd424b88e2933705f641c59ac44',1,'cv::rgbd::isValidDepth(const int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga8821699754cadee8a0f04f0622b673c7',1,'cv::rgbd::isValidDepth(const unsigned int &depth)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gaec2aff91f8f0600fb7024f57ca9c52c9',1,'isValidDepth(const float &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga34e1c9295a7216be59ca4da67d1f5eed',1,'isValidDepth(const double &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga74ef1e077263eb737b6349d3d3158f2f',1,'isValidDepth(const short int &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#gafb08f97f37ed0cda66e4f9c47828a0ff',1,'isValidDepth(const unsigned short int &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga1d690fd424b88e2933705f641c59ac44',1,'isValidDepth(const int &depth)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga8821699754cadee8a0f04f0622b673c7',1,'isValidDepth(const unsigned int &depth)(Global Namespace)']]], + ['isvector_293',['isVector',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#ad9a833a610fa8a02d1f840bd6f213086',1,'cv::_InputArray::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'Eigen::SparseMatrixBase::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< Transpose< MatrixType > >::isVector()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a7eedffa867031f649fd0fb9cc23ce4be',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::isVector()']]], + ['isvirtual_294',['isvirtual',['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a7380e9400279208cdd04ea836f79df8d',1,'cv::Subdiv2D::Vertex']]], + ['isxdigit_295',['isxdigit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2176db62da3573c57096dfe6c2221cb3',1,'std']]], + ['iszero_296',['isZero',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'Eigen::DenseBase::isZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'DenseBase< ArrayWrapper< ExpressionType > >::isZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::isZero()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#af36014ec300f53a65083057ed4e89822',1,'DenseBase< Solve< Decomposition, RhsType > >::isZero()']]], + ['items_297',['items',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a916a6ba75ec7624e9c6c977a52d6fd17.html#a916a6ba75ec7624e9c6c977a52d6fd17',1,'nlohmann::basic_json::items() noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a4faaed730a81347f2f01e93f37c73823.html#a4faaed730a81347f2f01e93f37c73823',1,'nlohmann::basic_json::items() const noexcept']]], + ['iter_5fswap_298',['iter_swap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gad93e66478d9a63e5777733be09931388',1,'std::iter_swap()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gad93e66478d9a63e5777733be09931388',1,'iter_swap()(Global Namespace)']]], + ['iterate_299',['iterate',['https://docs.opencv.org/4.2.0/d5/da0/classcv_1_1ximgproc_1_1SuperpixelLSC.html#a651e84e8a99145df8b560858d1fa070b',1,'cv::ximgproc::SuperpixelLSC::iterate()'],['https://docs.opencv.org/4.2.0/df/d81/classcv_1_1ximgproc_1_1SuperpixelSEEDS.html#afc35736ae52b277a1708b54037598cbb',1,'cv::ximgproc::SuperpixelSEEDS::iterate()'],['https://docs.opencv.org/4.2.0/d3/da9/classcv_1_1ximgproc_1_1SuperpixelSLIC.html#add5e65da972e5e00ce1753ea862f380c',1,'cv::ximgproc::SuperpixelSLIC::iterate()']]], + ['iterations_300',['iterations',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#ae778dd098bd5e6655625b20b1e9f15da',1,'Eigen::IterativeSolverBase::iterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#afbecc6d0ab1de42be9db79428da48ab6',1,'Eigen::RealQZ::iterations()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#afbecc6d0ab1de42be9db79428da48ab6',1,'RealQZ< MatrixType >::iterations()']]], + ['iterativesolverbase_301',['IterativeSolverBase',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a0922f2be45082690d7734aa6732fc493',1,'Eigen::IterativeSolverBase::IterativeSolverBase()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a3c68fe3cd929ea1ff8a0d4cbcd65ebad',1,'Eigen::IterativeSolverBase::IterativeSolverBase(const EigenBase< MatrixDerived > &A)']]], + ['iterator_5f_302',['iterator_',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a53fb6c07d7d3153087d79ca22c1a8ec0',1,'iterator_::iterator_()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a43fbe36e902b02465f9cd20a69cbd9a4',1,'iterator_::iterator_(pointer p_value, PB_DS_GEN_POS pos, PB_DS_CLASS_C_DEC *p_tbl)']]], + ['iterator_5fwrapper_303',['iterator_wrapper',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a22e2e5b0e68d9d7c63be2cada5187259.html#a22e2e5b0e68d9d7c63be2cada5187259',1,'nlohmann::basic_json::iterator_wrapper(reference ref) noexcept'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3710ff8c5a1cbedb4f75b700a8962d5c.html#a3710ff8c5a1cbedb4f75b700a8962d5c',1,'nlohmann::basic_json::iterator_wrapper(const_reference ref) noexcept']]], + ['iword_304',['iword',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_ios< char, _Traits >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_iostream< char >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_istream< char >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_istream< char, _Traits >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_ostream< char >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'basic_ostream< char, _Traits >::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_fstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ifstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ios::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_iostream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_istream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_istringstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ofstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ostream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_ostringstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::basic_stringstream::iword()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a25040dc1ead79e80cbdb4b5d692119f4',1,'std::ios_base::iword()']]] ]; diff --git a/search/functions_a.js b/search/functions_a.js index aeb1d268..f022d7ee 100644 --- a/search/functions_a.js +++ b/search/functions_a.js @@ -3,8 +3,8 @@ var searchData= ['jacobianposcontroller_0',['JacobianPosController',['../classcontrol_1_1JacobianPosController.html#a176b03c5cda298cd959ab7cbe202f9d6',1,'control::JacobianPosController']]], ['jacobianvelcontroller_1',['JacobianVelController',['../classJacobianVelController.html#a5650988ffe8c47a8d3b6400fdd116b23',1,'JacobianVelController']]], ['jacobirotation_2',['JacobiRotation',['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html#a38fec2c4da529ef3d05ff37b848b4227',1,'Eigen::JacobiRotation::JacobiRotation()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html#a3e8b5dc0a56f7a2d0f788b1ccb1547cb',1,'Eigen::JacobiRotation::JacobiRotation(const Scalar &c, const Scalar &s)']]], - ['jacobisvd_3',['jacobiSvd',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5745dca9c54390633b434e54a1d1eedd',1,'Eigen::MatrixBase::jacobiSvd()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5745dca9c54390633b434e54a1d1eedd',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::jacobiSvd()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5745dca9c54390633b434e54a1d1eedd',1,'MatrixBase< Solve< Decomposition, RhsType > >::jacobiSvd()']]], - ['jacobisvd_4',['JacobiSVD',['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a55315ab9cd060019a5ad07be798ff3b9',1,'Eigen::JacobiSVD::JacobiSVD()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#abfd1dd454a6e3edec7feecd97c818a78',1,'Eigen::JacobiSVD::JacobiSVD(const MatrixType &matrix, unsigned int computationOptions=0)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a5d9ea7c8f361337727260efd77ee03ac',1,'Eigen::JacobiSVD::JacobiSVD(Index rows, Index cols, unsigned int computationOptions=0)']]], + ['jacobisvd_3',['JacobiSVD',['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a55315ab9cd060019a5ad07be798ff3b9',1,'Eigen::JacobiSVD::JacobiSVD()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#abfd1dd454a6e3edec7feecd97c818a78',1,'Eigen::JacobiSVD::JacobiSVD(const MatrixType &matrix, unsigned int computationOptions=0)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiSVD.html#a5d9ea7c8f361337727260efd77ee03ac',1,'Eigen::JacobiSVD::JacobiSVD(Index rows, Index cols, unsigned int computationOptions=0)']]], + ['jacobisvd_4',['jacobiSvd',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5745dca9c54390633b434e54a1d1eedd',1,'Eigen::MatrixBase::jacobiSvd()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5745dca9c54390633b434e54a1d1eedd',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::jacobiSvd()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a5745dca9c54390633b434e54a1d1eedd',1,'MatrixBase< Solve< Decomposition, RhsType > >::jacobiSvd()']]], ['jflushstream_5',['jflushStream',['https://docs.opencv.org/4.2.0/d7/d13/classcv_1_1AVIWriteContainer.html#ad727ab9c530b7f85bf5cf455d5ea95c9',1,'cv::AVIWriteContainer']]], ['join_6',['join',['https://docs.opencv.org/4.2.0/dc/dfa/namespacecv_1_1utils_1_1fs.html#abd0ef8c83e77e143081b83a953492c7a',1,'cv::utils::fs']]], ['jointbilateralfilter_7',['jointBilateralFilter',['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga80b9b58fb85dd069691b709285ab985c',1,'cv::ximgproc::jointBilateralFilter()'],['https://docs.opencv.org/4.2.0/da/d17/group__ximgproc__filters.html#ga80b9b58fb85dd069691b709285ab985c',1,'jointBilateralFilter()(Global Namespace)']]], diff --git a/search/functions_b.js b/search/functions_b.js index 5e0fe18f..492fe856 100644 --- a/search/functions_b.js +++ b/search/functions_b.js @@ -1,7 +1,7 @@ var searchData= [ - ['k_0',['k',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#af928f60c8659aada87d333e379afcd1d',1,'std::negative_binomial_distribution']]], - ['k_1',['K',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#aa9171df82e517480b06d135ed1387dc3',1,'cv::detail::CameraParams']]], + ['k_0',['K',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#aa9171df82e517480b06d135ed1387dc3',1,'cv::detail::CameraParams']]], + ['k_1',['k',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#af928f60c8659aada87d333e379afcd1d',1,'std::negative_binomial_distribution']]], ['kalmanfilter_2',['KalmanFilter',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#ac0799f0611baee9e7e558f016e4a7b40',1,'cv::KalmanFilter::KalmanFilter()'],['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#abac82ecfa530611a163255bc7d91c088',1,'cv::KalmanFilter::KalmanFilter(int dynamParams, int measureParams, int controlParams=0, int type=CV_32F)']]], ['kernel_3',['Kernel',['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a4cd0a658f506b1eddb9ccaf51e4a78c9',1,'cv::ocl::Kernel::Kernel()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#ac65ad198b5346b5c48e496ff4b2c31fd',1,'cv::ocl::Kernel::Kernel(const char *kname, const Program &prog)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a0ed0338964e0672275ed7fa50f07ff76',1,'cv::ocl::Kernel::Kernel(const char *kname, const ProgramSource &prog, const String &buildopts=String(), String *errmsg=0)'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#afc037e65a7faf099602e1d959f7f8d23',1,'cv::ocl::Kernel::Kernel(const Kernel &k)']]], ['kernel_4',['kernel',['https://docs.opencv.org/4.2.0/d0/d71/classcv_1_1detail_1_1GCompoundKernelImpl.html#ac20bbde4cd0b865cc0eed17d10334b55',1,'cv::detail::GCompoundKernelImpl::kernel()'],['https://docs.opencv.org/4.2.0/d0/d6c/classcv_1_1GCPUKernelImpl.html#a4aad62ce08c53197bd4cbf0b4eead222',1,'cv::GCPUKernelImpl::kernel()'],['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1GFluidKernelImpl.html#a40c9b2a67c333453dff3d6e9adf2fdca',1,'cv::GFluidKernelImpl::kernel()'],['https://docs.opencv.org/4.2.0/d0/d0d/classcv_1_1GOCLKernelImpl.html#ac42fb5d276d34fdee3252879fe2ca72b',1,'cv::GOCLKernelImpl::kernel()'],['https://docs.opencv.org/4.2.0/d1/d8a/classcv_1_1GPlaidMLKernelImpl.html#a2e0fe6affe5fa2811a84585b437a2b5d',1,'cv::GPlaidMLKernelImpl::kernel()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#a70f52eeb2cd07dfbf790fce106fb4015',1,'Eigen::FullPivLU::kernel()']]], diff --git a/search/functions_c.js b/search/functions_c.js index 0b38b74f..692c3706 100644 --- a/search/functions_c.js +++ b/search/functions_c.js @@ -41,10 +41,10 @@ var searchData= ['lbgra_5fto_5flab_5f_38',['LBGRA_to_Lab_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9aeebe690ba2059fa3018bd265c6d0f',1,'cv::cudev::LBGRA_to_Lab_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9aeebe690ba2059fa3018bd265c6d0f',1,'LBGRA_to_Lab_()(Global Namespace)']]], ['lbgra_5fto_5fluv4_5f_39',['LBGRA_to_Luv4_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6f4dabb088b66506d680cbe9e3f453',1,'cv::cudev::LBGRA_to_Luv4_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6f4dabb088b66506d680cbe9e3f453',1,'LBGRA_to_Luv4_()(Global Namespace)']]], ['lbgra_5fto_5fluv_5f_40',['LBGRA_to_Luv_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8bb20d66cb1841769d78478f51cb276',1,'cv::cudev::LBGRA_to_Luv_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8bb20d66cb1841769d78478f51cb276',1,'LBGRA_to_Luv_()(Global Namespace)']]], - ['lda_41',['lda',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a3c05e9ccb53db6cae9254a71d73c87dd',1,'cv::LDA']]], - ['lda_42',['LDA',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a6d654ebfab272bf734a6ffa35b3ce908',1,'cv::LDA::LDA(int num_components=0)'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a5e8ec64b33aea2317631be0f9b85d833',1,'cv::LDA::LDA(InputArrayOfArrays src, InputArray labels, int num_components=0)']]], - ['ldlt_43',['ldlt',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ecf058a0727a4cab8b42d79e95072e1',1,'Eigen::MatrixBase::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ecf058a0727a4cab8b42d79e95072e1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ecf058a0727a4cab8b42d79e95072e1',1,'MatrixBase< Solve< Decomposition, RhsType > >::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a644155eef17b37c95d85b9f65bb49ac4',1,'Eigen::SelfAdjointView::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a644155eef17b37c95d85b9f65bb49ac4',1,'SelfAdjointView< const Derived, UpLo >::ldlt()']]], - ['ldlt_44',['LDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a2e06dedd2651649c5b251fbf9ba4e7d4',1,'Eigen::LDLT::LDLT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#ad0e8d2131ea1a626a08d98e9effb1cc5',1,'Eigen::LDLT::LDLT(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#adf853d6cbbc49f3535a44439bca344d9',1,'Eigen::LDLT::LDLT(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a154aa41bd2460199d48861eaf5e4f597',1,'Eigen::LDLT::LDLT(Index size)']]], + ['lda_41',['LDA',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a6d654ebfab272bf734a6ffa35b3ce908',1,'cv::LDA::LDA(int num_components=0)'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a5e8ec64b33aea2317631be0f9b85d833',1,'cv::LDA::LDA(InputArrayOfArrays src, InputArray labels, int num_components=0)']]], + ['lda_42',['lda',['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#a3c05e9ccb53db6cae9254a71d73c87dd',1,'cv::LDA']]], + ['ldlt_43',['LDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a2e06dedd2651649c5b251fbf9ba4e7d4',1,'Eigen::LDLT::LDLT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#ad0e8d2131ea1a626a08d98e9effb1cc5',1,'Eigen::LDLT::LDLT(const EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#adf853d6cbbc49f3535a44439bca344d9',1,'Eigen::LDLT::LDLT(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a154aa41bd2460199d48861eaf5e4f597',1,'Eigen::LDLT::LDLT(Index size)']]], + ['ldlt_44',['ldlt',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ecf058a0727a4cab8b42d79e95072e1',1,'Eigen::MatrixBase::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ecf058a0727a4cab8b42d79e95072e1',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ecf058a0727a4cab8b42d79e95072e1',1,'MatrixBase< Solve< Decomposition, RhsType > >::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a644155eef17b37c95d85b9f65bb49ac4',1,'Eigen::SelfAdjointView::ldlt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a644155eef17b37c95d85b9f65bb49ac4',1,'SelfAdjointView< const Derived, UpLo >::ldlt()']]], ['leastsquaresconjugategradient_45',['LeastSquaresConjugateGradient',['https://eigen.tuxfamily.org/dox/classEigen_1_1LeastSquaresConjugateGradient.html#ace69f423fcc1f8960d0e2de0667447c9',1,'Eigen::LeastSquaresConjugateGradient::LeastSquaresConjugateGradient()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LeastSquaresConjugateGradient.html#a91c4f2edc20f93cee9b721165937fb99',1,'Eigen::LeastSquaresConjugateGradient::LeastSquaresConjugateGradient(const EigenBase< MatrixDerived > &A)']]], ['leavebiggestcomponent_46',['leaveBiggestComponent',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#ga855d2fccbcfc3b3477b34d415be5e786',1,'cv::detail::leaveBiggestComponent()'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#ga855d2fccbcfc3b3477b34d415be5e786',1,'leaveBiggestComponent()(Global Namespace)']]], ['left_47',['left',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a96d1c2cab30f14f4e34ccb460f1ad1c9',1,'std']]], @@ -75,8 +75,8 @@ var searchData= ['list_72',['list',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8bd45a3517b01002de6debdb401d9170',1,'list< __inp, __rebind_inp >::list()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b6d1424066dbfd18daebac90d143837',1,'list< __inp, __rebind_inp >::list(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3f6568813bbdefbd94cbde64e3e45366',1,'list< __inp, __rebind_inp >::list(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac739777416320440d35c6de1a42ba818',1,'list< __inp, __rebind_inp >::list(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aec4657b924fb0c29b7d3e347a2da97f0',1,'list< __inp, __rebind_inp >::list(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a138af8bc9ad16e2d9f1f51057b50a786',1,'list< __inp, __rebind_inp >::list(list &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#abc914a91c0740ca3f52168d0b631dbf8',1,'list< __inp, __rebind_inp >::list(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad905b1f7f844c8715c654439611804a1',1,'list< __inp, __rebind_inp >::list(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8bd45a3517b01002de6debdb401d9170',1,'std::list::list()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b6d1424066dbfd18daebac90d143837',1,'std::list::list(const allocator_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a3f6568813bbdefbd94cbde64e3e45366',1,'std::list::list(size_type __n, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac739777416320440d35c6de1a42ba818',1,'std::list::list(size_type __n, const value_type &__value, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#aec4657b924fb0c29b7d3e347a2da97f0',1,'std::list::list(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a138af8bc9ad16e2d9f1f51057b50a786',1,'std::list::list(list &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#abc914a91c0740ca3f52168d0b631dbf8',1,'std::list::list(initializer_list< value_type > __l, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ad905b1f7f844c8715c654439611804a1',1,'std::list::list(_InputIterator __first, _InputIterator __last, const allocator_type &__a=allocator_type())']]], ['list_5fpartition_73',['list_partition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ad3be0fcbf87a1f43b3ecd406841e7b0d',1,'__gnu_parallel']]], ['list_5fupdate_74',['list_update',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11123.html#a9d7daaa0c1b890842f1117e4be17366d',1,'__gnu_pbds::list_update']]], - ['llt_75',['llt',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90c45f7a30265df792d5aeaddead2635',1,'Eigen::MatrixBase::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90c45f7a30265df792d5aeaddead2635',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90c45f7a30265df792d5aeaddead2635',1,'MatrixBase< Solve< Decomposition, RhsType > >::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a405e810491642a7f7b785f2ad6f93619',1,'Eigen::SelfAdjointView::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a405e810491642a7f7b785f2ad6f93619',1,'SelfAdjointView< const Derived, UpLo >::llt()']]], - ['llt_76',['LLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a16d1ec9ea6497ba1febb242c2e8a7a96',1,'Eigen::LLT::LLT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a1848a00addade9a0f7f70493c52ecc9d',1,'Eigen::LLT::LLT(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#ab3656cfbdf38e03c57d5cf79bf8131b6',1,'Eigen::LLT::LLT(Index size)']]], + ['llt_75',['LLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a16d1ec9ea6497ba1febb242c2e8a7a96',1,'Eigen::LLT::LLT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a1848a00addade9a0f7f70493c52ecc9d',1,'Eigen::LLT::LLT(EigenBase< InputType > &matrix)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#ab3656cfbdf38e03c57d5cf79bf8131b6',1,'Eigen::LLT::LLT(Index size)']]], + ['llt_76',['llt',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90c45f7a30265df792d5aeaddead2635',1,'Eigen::MatrixBase::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90c45f7a30265df792d5aeaddead2635',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a90c45f7a30265df792d5aeaddead2635',1,'MatrixBase< Solve< Decomposition, RhsType > >::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a405e810491642a7f7b785f2ad6f93619',1,'Eigen::SelfAdjointView::llt()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a405e810491642a7f7b785f2ad6f93619',1,'SelfAdjointView< const Derived, UpLo >::llt()']]], ['load_77',['load',['https://docs.opencv.org/4.2.0/d3/d46/classcv_1_1Algorithm.html#a623841c33b58ea9c4847da04607e067b',1,'cv::Algorithm::load()'],['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ac24cc2e2fc5cd1dd74fd5da31886fbb7',1,'cv::ml::ANN_MLP::load()'],['https://docs.opencv.org/4.2.0/de/d42/classcv_1_1datasets_1_1AR__hmdb.html#ac90c6e2af727fc53b7b0c65de75d75c9',1,'cv::datasets::AR_hmdb::load()'],['https://docs.opencv.org/4.2.0/d5/d36/classcv_1_1datasets_1_1AR__sports.html#a9e166c859594903c69aa455e6542276c',1,'cv::datasets::AR_sports::load()'],['https://docs.opencv.org/4.2.0/da/dd5/classcv_1_1BaseCascadeClassifier.html#a2d27bbc1d1d4fa7326848f9fae7999d7',1,'cv::BaseCascadeClassifier::load()'],['https://docs.opencv.org/4.2.0/d6/d7a/classcv_1_1ml_1_1Boost.html#a3ff5b7d19b3d715501b3ce4e1f0563e1',1,'cv::ml::Boost::load()'],['https://docs.opencv.org/4.2.0/d1/de5/classcv_1_1CascadeClassifier.html#a1a5884c8cc749422f9eb77c2471958bc',1,'cv::CascadeClassifier::load()'],['https://docs.opencv.org/4.2.0/d9/d2e/classcv_1_1datasets_1_1Dataset.html#a69d6b25f752721f9c4f6d6a1bf66aa5d',1,'cv::datasets::Dataset::load()'],['https://docs.opencv.org/4.2.0/d8/d89/classcv_1_1ml_1_1DTrees.html#a9a13c065058afce14367ca44739fb4df',1,'cv::ml::DTrees::load()'],['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#a90eec814e087b4d8c3ff9e92f8069f6a',1,'cv::ml::EM::load()'],['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#ae47c184a8b4234f20812abf9e7fb35f4',1,'cv::cudacodec::EncoderParams::load()'],['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1datasets_1_1FR__adience.html#a07d1b4cc4c889723ddce8871a3e163e0',1,'cv::datasets::FR_adience::load()'],['https://docs.opencv.org/4.2.0/dd/dda/classcv_1_1datasets_1_1FR__lfw.html#ab27b85e70528aeeac6d2df24de29b538',1,'cv::datasets::FR_lfw::load()'],['https://docs.opencv.org/4.2.0/d9/d14/classcv_1_1datasets_1_1GR__chalearn.html#a64506d54f0bb14d3ce08d1950ecd4fbd',1,'cv::datasets::GR_chalearn::load()'],['https://docs.opencv.org/4.2.0/d0/deb/classcv_1_1datasets_1_1GR__skig.html#a281a8a0041423d7bd251610cb40875e0',1,'cv::datasets::GR_skig::load()'],['https://docs.opencv.org/4.2.0/d5/d33/structcv_1_1HOGDescriptor.html#a957f55d36ba2f1a2ae47883c11f4b730',1,'cv::HOGDescriptor::load()'],['https://docs.opencv.org/4.2.0/d5/d42/classcv_1_1datasets_1_1HPE__humaneva.html#a269d8987797bffb9493782a8a40ed7f5',1,'cv::datasets::HPE_humaneva::load()'],['https://docs.opencv.org/4.2.0/d6/d72/classcv_1_1datasets_1_1HPE__parse.html#a0a0b7e768f05ebc8aa5161e8c56cf514',1,'cv::datasets::HPE_parse::load()'],['https://docs.opencv.org/4.2.0/d3/d20/classcv_1_1datasets_1_1IR__affine.html#ab42ab085a182539bd9d828cbeb63328f',1,'cv::datasets::IR_affine::load()'],['https://docs.opencv.org/4.2.0/d7/d5f/classcv_1_1datasets_1_1IR__robot.html#ab2ca17a360201029a1967af34dcc283e',1,'cv::datasets::IR_robot::load()'],['https://docs.opencv.org/4.2.0/dd/d0e/classcv_1_1datasets_1_1IS__bsds.html#a77835f3c33526b756a4f6c1ef3783333',1,'cv::datasets::IS_bsds::load()'],['https://docs.opencv.org/4.2.0/d9/dbe/classcv_1_1datasets_1_1IS__weizmann.html#a11aabfdc1bcea1d9f7311f2990fce38b',1,'cv::datasets::IS_weizmann::load()'],['https://docs.opencv.org/4.2.0/dd/de1/classcv_1_1ml_1_1KNearest.html#a99bf8ce6bba7fcfdd791c6e5eedae8ac',1,'cv::ml::KNearest::load()'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#ab5a8bf45f2ad6aee3b8b02a816cb1282',1,'cv::LDA::load(const String &filename)'],['https://docs.opencv.org/4.2.0/db/d59/classcv_1_1LDA.html#ace12ed0301bbd01b8fc16934c9a4c580',1,'cv::LDA::load(const FileStorage &node)'],['https://docs.opencv.org/4.2.0/d6/df9/classcv_1_1ml_1_1LogisticRegression.html#af3a20a4bc0f92ca2c5c1a2e46713b2f0',1,'cv::ml::LogisticRegression::load()'],['https://docs.opencv.org/4.2.0/d9/d5c/classcv_1_1face_1_1MACE.html#aeb77d3c0143b44269c556cff10f4e4a0',1,'cv::face::MACE::load()'],['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#a54407fef69977bb6344f0ec2e3678083',1,'cv::viz::Mesh::load()'],['https://docs.opencv.org/4.2.0/dc/de4/classcv_1_1datasets_1_1MSM__epfl.html#a5cea4fa9eae9bce324887310a3a31111',1,'cv::datasets::MSM_epfl::load()'],['https://docs.opencv.org/4.2.0/d2/dcc/classcv_1_1datasets_1_1MSM__middlebury.html#ae96c249cffcb6675ea6e120bcef24910',1,'cv::datasets::MSM_middlebury::load()'],['https://docs.opencv.org/4.2.0/d4/d8e/classcv_1_1ml_1_1NormalBayesClassifier.html#a147a2579967d89637f0434c261bfb1e0',1,'cv::ml::NormalBayesClassifier::load()'],['https://docs.opencv.org/4.2.0/db/df7/classcv_1_1datasets_1_1OR__imagenet.html#a5f1402f12579dbb8092ef6b5759ec455',1,'cv::datasets::OR_imagenet::load()'],['https://docs.opencv.org/4.2.0/d9/d92/classcv_1_1datasets_1_1OR__mnist.html#a471654dbc84df363ec29ca71ef68438c',1,'cv::datasets::OR_mnist::load()'],['https://docs.opencv.org/4.2.0/d4/d7e/classcv_1_1datasets_1_1OR__pascal.html#a2e4eb062497587b89f72e7495f0dfd05',1,'cv::datasets::OR_pascal::load()'],['https://docs.opencv.org/4.2.0/da/d69/classcv_1_1datasets_1_1OR__sun.html#a8cb3d99b80669c7d56c489916c541d3b',1,'cv::datasets::OR_sun::load()'],['https://docs.opencv.org/4.2.0/da/d8d/classcv_1_1datasets_1_1PD__caltech.html#ae5790097375df75df4e18f7dedfa366a',1,'cv::datasets::PD_caltech::load()'],['https://docs.opencv.org/4.2.0/d2/d61/classcv_1_1datasets_1_1PD__inria.html#afaec78fa88b3f0ad00bc9372615cb5e2',1,'cv::datasets::PD_inria::load()'],['https://docs.opencv.org/4.2.0/d0/d65/classcv_1_1ml_1_1RTrees.html#adada11573469e5df2e05da93e8239704',1,'cv::ml::RTrees::load()'],['https://docs.opencv.org/4.2.0/d6/d92/classcv_1_1datasets_1_1SLAM__kitti.html#a5df4388ba40eec6329d0b51bb9391279',1,'cv::datasets::SLAM_kitti::load()'],['https://docs.opencv.org/4.2.0/da/d91/classcv_1_1datasets_1_1SLAM__tumindoor.html#a508c646200a6f0b0a22a9d1dc69f2422',1,'cv::datasets::SLAM_tumindoor::load()'],['https://docs.opencv.org/4.2.0/d6/d05/classcv_1_1datasets_1_1SR__bsds.html#a193438fcd7b9f8b021e24bcc9cf53588',1,'cv::datasets::SR_bsds::load()'],['https://docs.opencv.org/4.2.0/d2/db5/classcv_1_1datasets_1_1SR__div2k.html#a6f5f65f5cbbade9f9cb98ea0037a541c',1,'cv::datasets::SR_div2k::load()'],['https://docs.opencv.org/4.2.0/d5/d19/classcv_1_1datasets_1_1SR__general100.html#a56fe96bac637d69ab01b8a815395d21d',1,'cv::datasets::SR_general100::load()'],['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a7b05db6110aec2246f2b31363937539c',1,'cv::ml::SVM::load()'],['https://docs.opencv.org/4.2.0/de/d54/classcv_1_1ml_1_1SVMSGD.html#a6945188e89c36b33187ab57dbc2364dc',1,'cv::ml::SVMSGD::load()'],['https://docs.opencv.org/4.2.0/d7/dc3/classcv_1_1datasets_1_1TR__chars.html#a4f357a12c26753335f5d7ff90f9cae3d',1,'cv::datasets::TR_chars::load()'],['https://docs.opencv.org/4.2.0/d7/dfb/classcv_1_1datasets_1_1TR__icdar.html#a803e5f1bfddaa201506204c51fb01f3d',1,'cv::datasets::TR_icdar::load()'],['https://docs.opencv.org/4.2.0/da/dc9/classcv_1_1datasets_1_1TR__svt.html#af4293f31c65df7994d06ccd06a57dd8d',1,'cv::datasets::TR_svt::load()'],['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a2518906ab9f5a89984f039fc737934d9',1,'cv::datasets::TRACK_alov::load()'],['https://docs.opencv.org/4.2.0/dc/d52/classcv_1_1datasets_1_1TRACK__vot.html#ac7dffefce0a572517d46728eddb76e74',1,'cv::datasets::TRACK_vot::load()']]], ['load_5ffactor_78',['load_factor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#add961e22f4549e2c94846946fbd25a7d',1,'std::unordered_map::load_factor()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a02888ba9dce21c5e16ba09734ebdb642',1,'std::unordered_multimap::load_factor()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a4105eeac8ec00dc431b408e8d046dd5e',1,'std::unordered_multiset::load_factor()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a6e7300347a4173c3ad35217600d28f50',1,'std::unordered_set::load_factor()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#add961e22f4549e2c94846946fbd25a7d',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::load_factor()']]], ['loadannotatedonly_79',['loadAnnotatedOnly',['https://docs.opencv.org/4.2.0/d8/d1c/classcv_1_1datasets_1_1TRACK__alov.html#a19bb9f5aae3ffdbf6b4b770e7b63ef98',1,'cv::datasets::TRACK_alov']]], @@ -144,8 +144,8 @@ var searchData= ['lsddetector_141',['LSDDetector',['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#a2a4e6484d35ea1a16cd89cf06bab6aef',1,'cv::line_descriptor::LSDDetector::LSDDetector()'],['https://docs.opencv.org/4.2.0/d1/dbd/classcv_1_1line__descriptor_1_1LSDDetector.html#a4f10b3e3cddf8c4f9ed306af8f7f621f',1,'cv::line_descriptor::LSDDetector::LSDDetector(LSDParam _params)']]], ['lsdparam_142',['LSDParam',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1line__descriptor_1_1LSDParam.html#ab9ed5e6e4d8b3d10a547e5c58d4a7545',1,'cv::line_descriptor::LSDParam']]], ['lshift_143',['lshift',['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gafd072accecb14c9adccdad45e3bf2300',1,'cv::cuda::lshift()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gafd072accecb14c9adccdad45e3bf2300',1,'lshift()(Global Namespace)']]], - ['lu_144',['lu',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb312afbfe960cbda67811552d876fae',1,'Eigen::MatrixBase::lu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb312afbfe960cbda67811552d876fae',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::lu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb312afbfe960cbda67811552d876fae',1,'MatrixBase< Solve< Decomposition, RhsType > >::lu()']]], - ['lu_145',['LU',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6caa4b9c6213b619c6e6f7523dc520fb',1,'cv::LU(float *A, size_t astep, int m, float *b, size_t bstep, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf80b646047515ac185536d342f3219a5',1,'cv::LU(double *A, size_t astep, int m, double *b, size_t bstep, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6caa4b9c6213b619c6e6f7523dc520fb',1,'LU(float *A, size_t astep, int m, float *b, size_t bstep, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf80b646047515ac185536d342f3219a5',1,'LU(double *A, size_t astep, int m, double *b, size_t bstep, int n)(Global Namespace)']]], + ['lu_144',['LU',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6caa4b9c6213b619c6e6f7523dc520fb',1,'cv::LU(float *A, size_t astep, int m, float *b, size_t bstep, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf80b646047515ac185536d342f3219a5',1,'cv::LU(double *A, size_t astep, int m, double *b, size_t bstep, int n)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga6caa4b9c6213b619c6e6f7523dc520fb',1,'LU(float *A, size_t astep, int m, float *b, size_t bstep, int n)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gaf80b646047515ac185536d342f3219a5',1,'LU(double *A, size_t astep, int m, double *b, size_t bstep, int n)(Global Namespace)']]], + ['lu_145',['lu',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb312afbfe960cbda67811552d876fae',1,'Eigen::MatrixBase::lu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb312afbfe960cbda67811552d876fae',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::lu()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#afb312afbfe960cbda67811552d876fae',1,'MatrixBase< Solve< Decomposition, RhsType > >::lu()']]], ['lu32f_146',['LU32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfb1d2c42a8292dd0f9bb63abd2c0d41',1,'cv::hal::LU32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacfb1d2c42a8292dd0f9bb63abd2c0d41',1,'LU32f()(Global Namespace)']]], ['lu64f_147',['LU64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga96b03c679e27c7cf3ec17823db7b260d',1,'cv::hal::LU64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga96b03c679e27c7cf3ec17823db7b260d',1,'LU64f()(Global Namespace)']]], ['lut_148',['LUT',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab55b8d062b7f5587720ede032d34156f',1,'cv::LUT()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga7f13dbe65b7df6816c53162647762a11',1,'cv::gapi::LUT()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab55b8d062b7f5587720ede032d34156f',1,'LUT(InputArray src, InputArray lut, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga7f13dbe65b7df6816c53162647762a11',1,'LUT(const GMat &src, const Mat &lut)(Global Namespace)']]], diff --git a/search/functions_d.js b/search/functions_d.js index e7538a4b..3e9ac6dc 100644 --- a/search/functions_d.js +++ b/search/functions_d.js @@ -67,243 +67,242 @@ var searchData= ['mat_64',['mat',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a42a7627680e1866327c479e0e38cc889',1,'cv::FileNode']]], ['mat_5f_65',['Mat_',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'cv::Mat_::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'cv::Mat_::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'cv::Mat_::Mat_(int _rows, int _cols, const _Tp &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'cv::Mat_::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'cv::Mat_::Mat_(Size _size, const _Tp &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'cv::Mat_::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'cv::Mat_::Mat_(int _ndims, const int *_sizes, const _Tp &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'cv::Mat_::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'cv::Mat_::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'cv::Mat_::Mat_(int _rows, int _cols, _Tp *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'cv::Mat_::Mat_(int _ndims, const int *_sizes, _Tp *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'cv::Mat_::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'cv::Mat_::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'cv::Mat_::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'cv::Mat_::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'cv::Mat_::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'cv::Mat_::Mat_(const std::vector< _Tp > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'cv::Mat_::Mat_(const Vec< typename DataType< _Tp >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'cv::Mat_::Mat_(const Matx< typename DataType< _Tp >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'cv::Mat_::Mat_(const Point_< typename DataType< _Tp >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'cv::Mat_::Mat_(const Point3_< typename DataType< _Tp >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'cv::Mat_::Mat_(const MatCommaInitializer_< _Tp > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'cv::Mat_::Mat_(std::initializer_list< _Tp > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'cv::Mat_::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< _Tp > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'cv::Mat_::Mat_(const std::array< _Tp, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'cv::Mat_::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'cv::Mat_::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'cv::Mat_::Mat_(MatExpr &&e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'Mat_< double >::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'Mat_< double >::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'Mat_< double >::Mat_(int _rows, int _cols, const double &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'Mat_< double >::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'Mat_< double >::Mat_(Size _size, const double &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'Mat_< double >::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'Mat_< double >::Mat_(int _ndims, const int *_sizes, const double &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'Mat_< double >::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'Mat_< double >::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'Mat_< double >::Mat_(int _rows, int _cols, double *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'Mat_< double >::Mat_(int _ndims, const int *_sizes, double *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'Mat_< double >::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'Mat_< double >::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'Mat_< double >::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'Mat_< double >::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'Mat_< double >::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'Mat_< double >::Mat_(const std::vector< double > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'Mat_< double >::Mat_(const Vec< typename DataType< double >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'Mat_< double >::Mat_(const Matx< typename DataType< double >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'Mat_< double >::Mat_(const Point_< typename DataType< double >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'Mat_< double >::Mat_(const Point3_< typename DataType< double >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'Mat_< double >::Mat_(const MatCommaInitializer_< double > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'Mat_< double >::Mat_(std::initializer_list< double > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'Mat_< double >::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< double > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'Mat_< double >::Mat_(const std::array< double, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'Mat_< double >::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'Mat_< double >::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'Mat_< double >::Mat_(MatExpr &&e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'Mat_< float >::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'Mat_< float >::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'Mat_< float >::Mat_(int _rows, int _cols, const float &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'Mat_< float >::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'Mat_< float >::Mat_(Size _size, const float &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'Mat_< float >::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'Mat_< float >::Mat_(int _ndims, const int *_sizes, const float &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'Mat_< float >::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'Mat_< float >::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'Mat_< float >::Mat_(int _rows, int _cols, float *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'Mat_< float >::Mat_(int _ndims, const int *_sizes, float *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'Mat_< float >::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'Mat_< float >::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'Mat_< float >::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'Mat_< float >::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'Mat_< float >::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'Mat_< float >::Mat_(const std::vector< float > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'Mat_< float >::Mat_(const Vec< typename DataType< float >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'Mat_< float >::Mat_(const Matx< typename DataType< float >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'Mat_< float >::Mat_(const Point_< typename DataType< float >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'Mat_< float >::Mat_(const Point3_< typename DataType< float >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'Mat_< float >::Mat_(const MatCommaInitializer_< float > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'Mat_< float >::Mat_(std::initializer_list< float > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'Mat_< float >::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< float > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'Mat_< float >::Mat_(const std::array< float, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'Mat_< float >::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'Mat_< float >::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'Mat_< float >::Mat_(MatExpr &&e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'Mat_< uchar >::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'Mat_< uchar >::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'Mat_< uchar >::Mat_(int _rows, int _cols, const uchar &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'Mat_< uchar >::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'Mat_< uchar >::Mat_(Size _size, const uchar &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'Mat_< uchar >::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'Mat_< uchar >::Mat_(int _ndims, const int *_sizes, const uchar &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'Mat_< uchar >::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'Mat_< uchar >::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'Mat_< uchar >::Mat_(int _rows, int _cols, uchar *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'Mat_< uchar >::Mat_(int _ndims, const int *_sizes, uchar *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'Mat_< uchar >::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'Mat_< uchar >::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'Mat_< uchar >::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'Mat_< uchar >::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'Mat_< uchar >::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'Mat_< uchar >::Mat_(const std::vector< uchar > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'Mat_< uchar >::Mat_(const Vec< typename DataType< uchar >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'Mat_< uchar >::Mat_(const Matx< typename DataType< uchar >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'Mat_< uchar >::Mat_(const Point_< typename DataType< uchar >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'Mat_< uchar >::Mat_(const Point3_< typename DataType< uchar >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'Mat_< uchar >::Mat_(const MatCommaInitializer_< uchar > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'Mat_< uchar >::Mat_(std::initializer_list< uchar > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'Mat_< uchar >::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< uchar > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'Mat_< uchar >::Mat_(const std::array< uchar, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'Mat_< uchar >::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'Mat_< uchar >::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'Mat_< uchar >::Mat_(MatExpr &&e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9174fa8a8a585519f9dbc66cd6c6dd0d',1,'Mat_< unsigned char >::Mat_()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7a91c0e8619ccfa7a63d536ce063b01',1,'Mat_< unsigned char >::Mat_(int _rows, int _cols)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a72f94c9747033770322c8ba999a19060',1,'Mat_< unsigned char >::Mat_(int _rows, int _cols, const unsigned char &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ade99270c6f5c60b3a4c1eb5119385027',1,'Mat_< unsigned char >::Mat_(Size _size)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac5f22035f88b2a463ab68c1fee2ee62b',1,'Mat_< unsigned char >::Mat_(Size _size, const unsigned char &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a93c79925d0230ba8cfbd86ed42443f01',1,'Mat_< unsigned char >::Mat_(int _ndims, const int *_sizes)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a48ab5d9545310327c129ffeb9cfdde97',1,'Mat_< unsigned char >::Mat_(int _ndims, const int *_sizes, const unsigned char &value)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a92472c5ecb8030dbb688a31cc57fbbb9',1,'Mat_< unsigned char >::Mat_(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41f78862f27556e7543b91134b1111ce',1,'Mat_< unsigned char >::Mat_(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a276b9680948ebd82e3d8a7c1fa77af3c',1,'Mat_< unsigned char >::Mat_(int _rows, int _cols, unsigned char *_data, size_t _step=AUTO_STEP)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9f08ebeff12b78438710ab8df39dbf2a',1,'Mat_< unsigned char >::Mat_(int _ndims, const int *_sizes, unsigned char *_data, const size_t *_steps=0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a5bc63a4d8c9d0506fcd361079a569835',1,'Mat_< unsigned char >::Mat_(const Mat_ &m, const Range &rowRange, const Range &colRange=Range::all())'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac9095ab4040f2f2b962b76f30d9749ca',1,'Mat_< unsigned char >::Mat_(const Mat_ &m, const Rect &roi)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0e3afdf239bc0f7ae8b0f1aa21cdecde',1,'Mat_< unsigned char >::Mat_(const Mat_ &m, const Range *ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a637c4db8ba98d4503cf23e479e0b0a2a',1,'Mat_< unsigned char >::Mat_(const Mat_ &m, const std::vector< Range > &ranges)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a8012482118389307b2c1c2749bd92436',1,'Mat_< unsigned char >::Mat_(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af182099c8156aac4b8663e3ab56ef947',1,'Mat_< unsigned char >::Mat_(const std::vector< unsigned char > &vec, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ab7f4599feca773449035562f6ff060b5',1,'Mat_< unsigned char >::Mat_(const Vec< typename DataType< unsigned char >::channel_type, n > &vec, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1593a8edebee83788413ff62ab815796',1,'Mat_< unsigned char >::Mat_(const Matx< typename DataType< unsigned char >::channel_type, m, n > &mtx, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aff88b69c597ace71450eca2f9180c8d1',1,'Mat_< unsigned char >::Mat_(const Point_< typename DataType< unsigned char >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6d36a5a2a566f2c81f1a4d2ab0c4fc69',1,'Mat_< unsigned char >::Mat_(const Point3_< typename DataType< unsigned char >::channel_type > &pt, bool copyData=true)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a461aed4ac941e71f8f15a6b0f71bb8ba',1,'Mat_< unsigned char >::Mat_(const MatCommaInitializer_< unsigned char > &commaInitializer)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a67a00bd469274c99f9126ba39f468680',1,'Mat_< unsigned char >::Mat_(std::initializer_list< unsigned char > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa03f563c3e57f876cab3c32cf8a740a9',1,'Mat_< unsigned char >::Mat_(const std::initializer_list< int > sizes, const std::initializer_list< unsigned char > values)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a05bad0192bc5f50ee6ddcd82335c9557',1,'Mat_< unsigned char >::Mat_(const std::array< unsigned char, _Nm > &arr, bool copyData=false)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a0a4e0ae63d8c2c3cf8b800015c665a19',1,'Mat_< unsigned char >::Mat_(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ae905219fa7ad76b70556e92b3436be2a',1,'Mat_< unsigned char >::Mat_(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac122681f603bfb895fb1b699af07d817',1,'Mat_< unsigned char >::Mat_(MatExpr &&e)']]], ['matallocator_66',['MatAllocator',['https://docs.opencv.org/4.2.0/df/d4c/classcv_1_1MatAllocator.html#a279cc239b836c7f06e60de9d00f8f73f',1,'cv::MatAllocator']]], - ['match_67',['Match',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#aa8283f8751fb7887d18eb024ef200adb',1,'cv::linemod::Match::Match()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0ee629062c3c2745dba41a3e3605ff49',1,'cv::linemod::Match::Match(int x, int y, float similarity, const String &class_id, int template_id)']]], + ['match_67',['Match',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#aa8283f8751fb7887d18eb024ef200adb',1,'cv::linemod::Match::Match()'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0ee629062c3c2745dba41a3e3605ff49',1,'cv::linemod::Match::Match(int x, int y, float similarity, const String &class_id, int template_id)'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0ee629062c3c2745dba41a3e3605ff49',1,'Match()(Global Namespace)']]], ['match_68',['match',['https://docs.opencv.org/4.2.0/d3/dda/classcv_1_1detail_1_1AffineBestOf2NearestMatcher.html#a565d4c8159841f78b6a27e479c45f2f9',1,'cv::detail::AffineBestOf2NearestMatcher::match()'],['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#ad50ac0d2cbc1d4ee3c52ec7a81d63408',1,'cv::detail::BestOf2NearestMatcher::match()'],['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html#a72ab280d507ccb95240300ecd0b00fc0',1,'cv::line_descriptor::BinaryDescriptorMatcher::match(const Mat &queryDescriptors, const Mat &trainDescriptors, std::vector< DMatch > &matches, const Mat &mask=Mat()) const'],['https://docs.opencv.org/4.2.0/d2/dde/classcv_1_1line__descriptor_1_1BinaryDescriptorMatcher.html#a0f353796fee66fe7e2692a5cce29861d',1,'cv::line_descriptor::BinaryDescriptorMatcher::match(const Mat &queryDescriptors, std::vector< DMatch > &matches, const std::vector< Mat > &masks=std::vector< Mat >())'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a0f046f47b68ec7074391e1e85c750cba',1,'cv::DescriptorMatcher::match(InputArray queryDescriptors, InputArray trainDescriptors, std::vector< DMatch > &matches, InputArray mask=noArray()) const'],['https://docs.opencv.org/4.2.0/db/d39/classcv_1_1DescriptorMatcher.html#a695c0aceafc907c024c24a0b5cdff758',1,'cv::DescriptorMatcher::match(InputArray queryDescriptors, std::vector< DMatch > &matches, InputArrayOfArrays masks=noArray())'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a062cb997b9031a7acbe77f4f60682304',1,'cv::cuda::DescriptorMatcher::match(InputArray queryDescriptors, InputArray trainDescriptors, std::vector< DMatch > &matches, InputArray mask=noArray())=0'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a71f79d53a5d321077b43bf25603a306e',1,'cv::cuda::DescriptorMatcher::match(InputArray queryDescriptors, std::vector< DMatch > &matches, const std::vector< GpuMat > &masks=std::vector< GpuMat >())=0'],['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a57ec7d6920aa3d31f91ac6972cb12ee5',1,'cv::linemod::Detector::match()'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a22005bcc8bf637398b2a325121b44bb1',1,'cv::detail::FeaturesMatcher::match()'],['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a13757c035f9c95841f7f14f6170c8ffc',1,'cv::ppf_match_3d::PPF3DDetector::match()'],['https://docs.opencv.org/4.2.0/d2/d58/classcv_1_1cuda_1_1TemplateMatching.html#a05a565a53461c916b3b10737cbe43a01',1,'cv::cuda::TemplateMatching::match()']]], - ['match_69',['Match',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html#ga0ee629062c3c2745dba41a3e3605ff49',1,]]], - ['match_5fresults_70',['match_results',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a71da2bf97751acc14fe35dd77013485c',1,'match_results< _Bi_iter >::match_results(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a65c2c5b7bac305ad0c09cc96b3f39d71',1,'match_results< _Bi_iter >::match_results(match_results &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ad83ac42bb1d27df742e20884719b7359',1,'match_results< _Bi_iter >::match_results()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6eae2dd42c7d50268871d04fb640759d',1,'match_results< _Bi_iter >::match_results(const allocator< sub_match< _Bi_iter > > &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ad83ac42bb1d27df742e20884719b7359',1,'match_results< _Bi_iter >::match_results()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6eae2dd42c7d50268871d04fb640759d',1,'match_results< _Bi_iter >::match_results(const allocator< sub_match< _Bi_iter > > &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a71da2bf97751acc14fe35dd77013485c',1,'std::match_results::match_results(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a65c2c5b7bac305ad0c09cc96b3f39d71',1,'std::match_results::match_results(match_results &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ad83ac42bb1d27df742e20884719b7359',1,'std::match_results::match_results()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6eae2dd42c7d50268871d04fb640759d',1,'std::match_results::match_results(const _Alloc &__a) noexcept']]], - ['matchasync_71',['matchAsync',['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#aad20d402f63e8d01cbf881476ea1a798',1,'cv::cuda::DescriptorMatcher::matchAsync(InputArray queryDescriptors, InputArray trainDescriptors, OutputArray matches, InputArray mask=noArray(), Stream &stream=Stream::Null())=0'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a4d255fb28411740971a763747109d4e3',1,'cv::cuda::DescriptorMatcher::matchAsync(InputArray queryDescriptors, OutputArray matches, const std::vector< GpuMat > &masks=std::vector< GpuMat >(), Stream &stream=Stream::Null())=0']]], - ['matchclass_72',['matchClass',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a189b904ea0b9e500c5c64a52da9ec73c',1,'cv::linemod::Detector']]], - ['matchconvert_73',['matchConvert',['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a567592e9866ee163c353acc39850a7fb',1,'cv::cuda::DescriptorMatcher']]], - ['matchesgraphasstring_74',['matchesGraphAsString',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gabaeb9dab170ea8066ae2583bf3a669e9',1,'cv::detail::matchesGraphAsString()'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gabaeb9dab170ea8066ae2583bf3a669e9',1,'matchesGraphAsString()(Global Namespace)']]], - ['matchesinfo_75',['MatchesInfo',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#aeafb1a764b2fe15f8c5c0fcd790f5d2a',1,'cv::detail::MatchesInfo::MatchesInfo()'],['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#aa99a3ff020a99c03c4016deadbf28d42',1,'cv::detail::MatchesInfo::MatchesInfo(const MatchesInfo &other)']]], - ['matchgms_76',['matchGMS',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#gaaf19e0024c555f8d8982396376150288',1,'cv::xfeatures2d::matchGMS()'],['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#gaaf19e0024c555f8d8982396376150288',1,'matchGMS()(Global Namespace)']]], - ['matching_77',['Matching',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a6fdc5a79dd5408b8d865a594f56dae2b',1,'cv::stereo::Matching::Matching(void)'],['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a07f5f3e41212ea87c0314a264ee8865b',1,'cv::stereo::Matching::Matching(int maxDisp, int scalling=4, int confidence=6)']]], - ['matchingmask_78',['matchingMask',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a4b2624192c5854601f4baebeee321c81',1,'cv::Stitcher']]], - ['matchlogos_79',['matchLOGOS',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#ga55b555fffec434bf0cdf99b454056f7b',1,'cv::xfeatures2d::matchLOGOS()'],['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#ga55b555fffec434bf0cdf99b454056f7b',1,'matchLOGOS()(Global Namespace)']]], - ['matchshapes_80',['matchShapes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaadc90cb16e2362c9bd6e7363e6e4c317',1,'cv::matchShapes()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaadc90cb16e2362c9bd6e7363e6e4c317',1,'matchShapes()(Global Namespace)']]], - ['matchtemplate_81',['matchTemplate',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#ga586ebfb0a7fb604b35a23d85391329be',1,'cv::matchTemplate()'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#ga586ebfb0a7fb604b35a23d85391329be',1,'matchTemplate()(Global Namespace)']]], - ['matchtemplatedistance_82',['MatchTemplateDistance',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1tbm_1_1MatchTemplateDistance.html#a585d8ca37c334ef9d29c93a09f0c94cd',1,'cv::tbm::MatchTemplateDistance']]], - ['matcommainitializer_5f_83',['MatCommaInitializer_',['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html#a4feb484303b5f8d2a6198caed71d8841',1,'cv::MatCommaInitializer_']]], - ['matconstiterator_84',['MatConstIterator',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a11c8b512e764c96c1e4ec6519df84503',1,'cv::MatConstIterator::MatConstIterator()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#adeb2d3232dd4fa391e9737d5ae079c33',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ac18a34a9c94f8a1f62a7f5e514c357be',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m, int _row, int _col=0)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a8dae0cd35279f7707dc8087374549c44',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m, Point _pt)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a1057d9eb074d77ff7b87566aebcb88b3',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m, const int *_idx)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a9635c2a5d18f3b875d98c8cef90fc9b5',1,'cv::MatConstIterator::MatConstIterator(const MatConstIterator &it)']]], - ['matconstiterator_5f_85',['MatConstIterator_',['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a452adcda3e2fb13eaf6f53456e6686e7',1,'cv::MatConstIterator_::MatConstIterator_()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#aeb5d9d2b765c182be0b731ff8bfedc11',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#aba7a798f9ea3adeb24dc358a60cac7a1',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m, int _row, int _col=0)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a6f2a3324d41f00c57f5f52bd2dc54356',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m, Point _pt)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ac3fcc7f48d7159e32d277bfcdf8bc485',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m, const int *_idx)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#aa8e7fdafb5cf5b8c7561477b3aebea33',1,'cv::MatConstIterator_::MatConstIterator_(const MatConstIterator_ &it)']]], - ['matexpr_86',['MatExpr',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a667e294461d09da9a1b1760d33adbbc8',1,'cv::MatExpr::MatExpr()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a18f051615e9350438ef369c9dca01e6a',1,'cv::MatExpr::MatExpr(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae38c3e856d93e7cffb9f14c894a76c17',1,'cv::MatExpr::MatExpr(const MatOp *_op, int _flags, const Mat &_a=Mat(), const Mat &_b=Mat(), const Mat &_c=Mat(), double _alpha=1, double _beta=1, const Scalar &_s=Scalar())']]], - ['matheader_87',['MatHeader',['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a4c70f10de37911136c772a2a757c7330',1,'cv::gapi::own::detail::MatHeader::MatHeader()=default'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a96dd538e3f126b1345d1e51f26725f75',1,'cv::gapi::own::detail::MatHeader::MatHeader(int _rows, int _cols, int type, void *_data, size_t _step)'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a102f051bfd010997f96a90d8be931a9c',1,'cv::gapi::own::detail::MatHeader::MatHeader(const std::vector< int > &_dims, int type, void *_data)'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a1312f98f9299bba8f423babcab4cfb3a',1,'cv::gapi::own::detail::MatHeader::MatHeader(const MatHeader &)=default'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#adcb44c4766a33685aaf9550b4450d827',1,'cv::gapi::own::detail::MatHeader::MatHeader(MatHeader &&src)']]], - ['matiterator_5f_88',['MatIterator_',['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a309c4d310a2feea6f2153ae163057554',1,'cv::MatIterator_::MatIterator_()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ae7e45a26abfc2e14887f63016a6f625e',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a2535ef5b07ad7eeb66c502802ed87cb4',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m, int _row, int _col=0)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a2819a88c03e10d4eb34e104360080b01',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m, Point _pt)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a58e15db8d9e0631fdfe4a397e11523f3',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m, const int *_idx)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a7a90a2116ed74e442d38959b31990bbf',1,'cv::MatIterator_::MatIterator_(const MatIterator_ &it)']]], - ['matmul_89',['matmul',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#affcfaf5b1087ec3359583a9a7a38f9f0',1,'cv::MatOp']]], - ['matmulderiv_90',['matMulDeriv',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga905541c1275852eabff7dbdfbc10d160',1,'cv::matMulDeriv()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga905541c1275852eabff7dbdfbc10d160',1,'matMulDeriv()(Global Namespace)']]], - ['matop_91',['MatOp',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ac6eeff02c5ef401a8c1dcd150551f004',1,'cv::MatOp']]], + ['match_5fresults_69',['match_results',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a71da2bf97751acc14fe35dd77013485c',1,'match_results< _Bi_iter >::match_results(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a65c2c5b7bac305ad0c09cc96b3f39d71',1,'match_results< _Bi_iter >::match_results(match_results &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ad83ac42bb1d27df742e20884719b7359',1,'match_results< _Bi_iter >::match_results()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6eae2dd42c7d50268871d04fb640759d',1,'match_results< _Bi_iter >::match_results(const allocator< sub_match< _Bi_iter > > &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ad83ac42bb1d27df742e20884719b7359',1,'match_results< _Bi_iter >::match_results()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6eae2dd42c7d50268871d04fb640759d',1,'match_results< _Bi_iter >::match_results(const allocator< sub_match< _Bi_iter > > &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a71da2bf97751acc14fe35dd77013485c',1,'std::match_results::match_results(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a65c2c5b7bac305ad0c09cc96b3f39d71',1,'std::match_results::match_results(match_results &&) noexcept=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#ad83ac42bb1d27df742e20884719b7359',1,'std::match_results::match_results()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6eae2dd42c7d50268871d04fb640759d',1,'std::match_results::match_results(const _Alloc &__a) noexcept']]], + ['matchasync_70',['matchAsync',['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#aad20d402f63e8d01cbf881476ea1a798',1,'cv::cuda::DescriptorMatcher::matchAsync(InputArray queryDescriptors, InputArray trainDescriptors, OutputArray matches, InputArray mask=noArray(), Stream &stream=Stream::Null())=0'],['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a4d255fb28411740971a763747109d4e3',1,'cv::cuda::DescriptorMatcher::matchAsync(InputArray queryDescriptors, OutputArray matches, const std::vector< GpuMat > &masks=std::vector< GpuMat >(), Stream &stream=Stream::Null())=0']]], + ['matchclass_71',['matchClass',['https://docs.opencv.org/4.2.0/d7/d07/classcv_1_1linemod_1_1Detector.html#a189b904ea0b9e500c5c64a52da9ec73c',1,'cv::linemod::Detector']]], + ['matchconvert_72',['matchConvert',['https://docs.opencv.org/4.2.0/dd/dc5/classcv_1_1cuda_1_1DescriptorMatcher.html#a567592e9866ee163c353acc39850a7fb',1,'cv::cuda::DescriptorMatcher']]], + ['matchesgraphasstring_73',['matchesGraphAsString',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gabaeb9dab170ea8066ae2583bf3a669e9',1,'cv::detail::matchesGraphAsString()'],['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html#gabaeb9dab170ea8066ae2583bf3a669e9',1,'matchesGraphAsString()(Global Namespace)']]], + ['matchesinfo_74',['MatchesInfo',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#aeafb1a764b2fe15f8c5c0fcd790f5d2a',1,'cv::detail::MatchesInfo::MatchesInfo()'],['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#aa99a3ff020a99c03c4016deadbf28d42',1,'cv::detail::MatchesInfo::MatchesInfo(const MatchesInfo &other)']]], + ['matchgms_75',['matchGMS',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#gaaf19e0024c555f8d8982396376150288',1,'cv::xfeatures2d::matchGMS()'],['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#gaaf19e0024c555f8d8982396376150288',1,'matchGMS()(Global Namespace)']]], + ['matching_76',['Matching',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a6fdc5a79dd5408b8d865a594f56dae2b',1,'cv::stereo::Matching::Matching(void)'],['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a07f5f3e41212ea87c0314a264ee8865b',1,'cv::stereo::Matching::Matching(int maxDisp, int scalling=4, int confidence=6)']]], + ['matchingmask_77',['matchingMask',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#a4b2624192c5854601f4baebeee321c81',1,'cv::Stitcher']]], + ['matchlogos_78',['matchLOGOS',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#ga55b555fffec434bf0cdf99b454056f7b',1,'cv::xfeatures2d::matchLOGOS()'],['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html#ga55b555fffec434bf0cdf99b454056f7b',1,'matchLOGOS()(Global Namespace)']]], + ['matchshapes_79',['matchShapes',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaadc90cb16e2362c9bd6e7363e6e4c317',1,'cv::matchShapes()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gaadc90cb16e2362c9bd6e7363e6e4c317',1,'matchShapes()(Global Namespace)']]], + ['matchtemplate_80',['matchTemplate',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#ga586ebfb0a7fb604b35a23d85391329be',1,'cv::matchTemplate()'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html#ga586ebfb0a7fb604b35a23d85391329be',1,'matchTemplate()(Global Namespace)']]], + ['matchtemplatedistance_81',['MatchTemplateDistance',['https://docs.opencv.org/4.2.0/d3/d3c/classcv_1_1tbm_1_1MatchTemplateDistance.html#a585d8ca37c334ef9d29c93a09f0c94cd',1,'cv::tbm::MatchTemplateDistance']]], + ['matcommainitializer_5f_82',['MatCommaInitializer_',['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html#a4feb484303b5f8d2a6198caed71d8841',1,'cv::MatCommaInitializer_']]], + ['matconstiterator_83',['MatConstIterator',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a11c8b512e764c96c1e4ec6519df84503',1,'cv::MatConstIterator::MatConstIterator()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#adeb2d3232dd4fa391e9737d5ae079c33',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ac18a34a9c94f8a1f62a7f5e514c357be',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m, int _row, int _col=0)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a8dae0cd35279f7707dc8087374549c44',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m, Point _pt)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a1057d9eb074d77ff7b87566aebcb88b3',1,'cv::MatConstIterator::MatConstIterator(const Mat *_m, const int *_idx)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a9635c2a5d18f3b875d98c8cef90fc9b5',1,'cv::MatConstIterator::MatConstIterator(const MatConstIterator &it)']]], + ['matconstiterator_5f_84',['MatConstIterator_',['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a452adcda3e2fb13eaf6f53456e6686e7',1,'cv::MatConstIterator_::MatConstIterator_()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#aeb5d9d2b765c182be0b731ff8bfedc11',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#aba7a798f9ea3adeb24dc358a60cac7a1',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m, int _row, int _col=0)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a6f2a3324d41f00c57f5f52bd2dc54356',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m, Point _pt)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ac3fcc7f48d7159e32d277bfcdf8bc485',1,'cv::MatConstIterator_::MatConstIterator_(const Mat_< _Tp > *_m, const int *_idx)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#aa8e7fdafb5cf5b8c7561477b3aebea33',1,'cv::MatConstIterator_::MatConstIterator_(const MatConstIterator_ &it)']]], + ['matexpr_85',['MatExpr',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a667e294461d09da9a1b1760d33adbbc8',1,'cv::MatExpr::MatExpr()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a18f051615e9350438ef369c9dca01e6a',1,'cv::MatExpr::MatExpr(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae38c3e856d93e7cffb9f14c894a76c17',1,'cv::MatExpr::MatExpr(const MatOp *_op, int _flags, const Mat &_a=Mat(), const Mat &_b=Mat(), const Mat &_c=Mat(), double _alpha=1, double _beta=1, const Scalar &_s=Scalar())']]], + ['matheader_86',['MatHeader',['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a4c70f10de37911136c772a2a757c7330',1,'cv::gapi::own::detail::MatHeader::MatHeader()=default'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a96dd538e3f126b1345d1e51f26725f75',1,'cv::gapi::own::detail::MatHeader::MatHeader(int _rows, int _cols, int type, void *_data, size_t _step)'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a102f051bfd010997f96a90d8be931a9c',1,'cv::gapi::own::detail::MatHeader::MatHeader(const std::vector< int > &_dims, int type, void *_data)'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a1312f98f9299bba8f423babcab4cfb3a',1,'cv::gapi::own::detail::MatHeader::MatHeader(const MatHeader &)=default'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#adcb44c4766a33685aaf9550b4450d827',1,'cv::gapi::own::detail::MatHeader::MatHeader(MatHeader &&src)']]], + ['matiterator_5f_87',['MatIterator_',['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a309c4d310a2feea6f2153ae163057554',1,'cv::MatIterator_::MatIterator_()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ae7e45a26abfc2e14887f63016a6f625e',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a2535ef5b07ad7eeb66c502802ed87cb4',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m, int _row, int _col=0)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a2819a88c03e10d4eb34e104360080b01',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m, Point _pt)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a58e15db8d9e0631fdfe4a397e11523f3',1,'cv::MatIterator_::MatIterator_(Mat_< _Tp > *_m, const int *_idx)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a7a90a2116ed74e442d38959b31990bbf',1,'cv::MatIterator_::MatIterator_(const MatIterator_ &it)']]], + ['matmul_88',['matmul',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#affcfaf5b1087ec3359583a9a7a38f9f0',1,'cv::MatOp']]], + ['matmulderiv_89',['matMulDeriv',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga905541c1275852eabff7dbdfbc10d160',1,'cv::matMulDeriv()'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ga905541c1275852eabff7dbdfbc10d160',1,'matMulDeriv()(Global Namespace)']]], + ['matop_90',['MatOp',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ac6eeff02c5ef401a8c1dcd150551f004',1,'cv::MatOp']]], + ['matrix_91',['Matrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Eigen::Matrix::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Eigen::Matrix::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Eigen::Matrix::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Eigen::Matrix::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Eigen::Matrix::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Eigen::Matrix::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Eigen::Matrix::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Eigen::Matrix::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Eigen::Matrix::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Eigen::Matrix::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Eigen::Matrix::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Eigen::Matrix::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Eigen::Matrix::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, 3, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, 3, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, 3, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, 3, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, 3, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, 3, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, 3, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Dim, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Dim, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Dim, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Dim, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Dim, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Dim, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Dynamic, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index rows, Index cols)']]], ['matrix_92',['matrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#af01e9ea8087e390af8af453bbe4c276c',1,'Eigen::ArrayBase::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#af01e9ea8087e390af8af453bbe4c276c',1,'ArrayBase< ArrayWrapper< ExpressionType > >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'Eigen::RotationBase::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< AngleAxis< _Scalar >, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Derived, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a91b5bdb1c7b90ec7b33107c6f7d3b171',1,'RotationBase< Rotation2D< _Scalar >, 2 >::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a758fbaf6aa41a5493659aa0c9bfe0dcf',1,'Eigen::Transform::matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a0ac079dc1995058cbbded553b8d4485c',1,'Eigen::Transform::matrix() const']]], - ['matrix_93',['Matrix',['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Eigen::Matrix::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Eigen::Matrix::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Eigen::Matrix::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Eigen::Matrix::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Eigen::Matrix::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Eigen::Matrix::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Eigen::Matrix::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Eigen::Matrix::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Eigen::Matrix::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Eigen::Matrix::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Eigen::Matrix::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Eigen::Matrix::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Eigen::Matrix::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< RealScalar, Dynamic, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, 3, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, 3, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, 3, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, 3, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, 3, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, 3, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, 3, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, 3, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Dim, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Dim, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Dim, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Dim, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Dim, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Dim, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Dim, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Dynamic, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Dynamic, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< StorageIndex, Dynamic, 1 >::Matrix(Index rows, Index cols)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a8f7eef9d36f1057338309afb339c1661',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac1a504f785d221680d41d25224a64ce3',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3615e7b050e4432e19189d5cf6671869',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2f6bdcb76b48999cb9135b828bba4e7d',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a25719cfdf1a07ba77708dbc6b3c79e96',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &a0, const Scalar &a1, const Scalar &a2, const Scalar &a3, const ArgTypes &... args)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a94173a014c2bdc8add568f43ddfd85af',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a285010dc9f5dd33b030dd115ff6f6307',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3166762a368fd1dec9bfa57e4e76bb50',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1b56bac44d4b7d0d652f03daf6d99dca',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar &x, const Scalar &y, const Scalar &z, const Scalar &w)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#ac59ab3932980f113533eaed7fc651756',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const Scalar *data)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#afaad3c2d97f248465fa63ce43ac9eb42',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(const std::initializer_list< std::initializer_list< Scalar > > &list)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a1c8627a7a051df98bdf6daab12852e02',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index dim)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#adca6b686dcbf607bd53a8cbe4dfed85c',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::Matrix(Index rows, Index cols)']]], - ['matrixfunction_94',['matrixFunction',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1a6cc9f734eb175e785a1118305245fc',1,'Eigen::MatrixBase::matrixFunction()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1a6cc9f734eb175e785a1118305245fc',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::matrixFunction()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1a6cc9f734eb175e785a1118305245fc',1,'MatrixBase< Solve< Decomposition, RhsType > >::matrixFunction()']]], - ['matrixh_95',['matrixH',['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a8e781d2e22a2304647bcf0ae913cc8ea',1,'Eigen::HessenbergDecomposition::matrixH()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a8e781d2e22a2304647bcf0ae913cc8ea',1,'HessenbergDecomposition< MatrixType >::matrixH()']]], - ['matrixl_96',['matrixL',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a7d1f1878505fd1862e6f2286d27ff09a',1,'Eigen::IncompleteCholesky::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#af0e6a0df5679873b42cf82a372dd8ddb',1,'Eigen::LDLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a7f4a3eedbf82e7ce2d6bf0dcd84cdfa3',1,'Eigen::LLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a80dfe1f4b4c8991252178de385e310bc',1,'Eigen::SimplicialLDLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a232f994f0106fa405c4066f7dbf81c95',1,'Eigen::SimplicialLLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a35df62f4c1f7ed32f6ac39d94701b9a8',1,'Eigen::SparseLU::matrixL()']]], - ['matrixldlt_97',['matrixLDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#aa5e0fd09dcd5251a8521fa248b95db0b',1,'Eigen::LDLT']]], - ['matrixllt_98',['matrixLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#af62881fc95c7e54a93b63c20f2c62b46',1,'Eigen::LLT']]], - ['matrixlu_99',['matrixLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#afea0b8fc707a9097d46fe358cb18bbff',1,'Eigen::FullPivLU::matrixLU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#abea0d7e51c5591a6db152eade0892d9c',1,'Eigen::PartialPivLU::matrixLU()']]], - ['matrixq_100',['matrixQ',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#ad26dd2d3c002939771d2375e4e051c28',1,'Eigen::FullPivHouseholderQR::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a346441e4902a58d43d698ac3da6ff791',1,'Eigen::HessenbergDecomposition::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a346441e4902a58d43d698ac3da6ff791',1,'HessenbergDecomposition< MatrixType >::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a212bc2f69ea4eff830fde70e209e40fb',1,'Eigen::RealQZ::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a212bc2f69ea4eff830fde70e209e40fb',1,'RealQZ< MatrixType >::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a348c5c00788b912c2bcb3e80be467877',1,'Eigen::SparseQR::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a4179a9d595d9bd58a649ef695b3db3c3',1,'Eigen::SPQR::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a000f7392eda930576ffd2af1fae54af2',1,'Eigen::Tridiagonalization::matrixQ()']]], - ['matrixqr_101',['matrixQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aa572ac050c8d4fadd4f08a87f6b1e62b',1,'Eigen::ColPivHouseholderQR::matrixQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aa572ac050c8d4fadd4f08a87f6b1e62b',1,'ColPivHouseholderQR< MatrixType >::matrixQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a9c16411e5d8f1fc634a5797018d5aa3e',1,'Eigen::FullPivHouseholderQR::matrixQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#ae837f2fb30099212c53b3042c7d699c9',1,'Eigen::HouseholderQR::matrixQR()']]], - ['matrixqtz_102',['matrixQTZ',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ad89e2529fc1a8721239d9b6be9613a69',1,'Eigen::CompleteOrthogonalDecomposition']]], - ['matrixr_103',['matrixR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a44c534d47bde6b67ce4b5247d142ef30',1,'Eigen::ColPivHouseholderQR::matrixR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a44c534d47bde6b67ce4b5247d142ef30',1,'ColPivHouseholderQR< MatrixType >::matrixR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#abe62644e0879b3e75836d63edf623899',1,'Eigen::SparseQR::matrixR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a99389f43e9eebe0b222e3b75318046e5',1,'Eigen::SPQR::matrixR()']]], - ['matrixs_104',['matrixS',['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ad24d7bf534afb55adaef00f00846adaf',1,'Eigen::RealQZ::matrixS()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ad24d7bf534afb55adaef00f00846adaf',1,'RealQZ< MatrixType >::matrixS()']]], - ['matrixt_105',['matrixT',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a806213f5c96ff765265f47067229586d',1,'Eigen::CompleteOrthogonalDecomposition::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#add3ab5ed83f7f2f06b79fa910a2d5684',1,'Eigen::ComplexSchur::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#add3ab5ed83f7f2f06b79fa910a2d5684',1,'ComplexSchur< MatrixType >::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a8dc963d8ea2a17df9d8d718e9e34d06f',1,'Eigen::RealQZ::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a8dc963d8ea2a17df9d8d718e9e34d06f',1,'RealQZ< MatrixType >::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#abb78996b43b8642a5f507415730445cb',1,'Eigen::RealSchur::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#abb78996b43b8642a5f507415730445cb',1,'RealSchur< MatrixType >::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a6eb5ef94b8b9bb013c0e69b6df56d0df',1,'Eigen::Tridiagonalization::matrixT()']]], - ['matrixu_106',['matrixU',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#afed8177cf9836f032d42bdb6c6bc6e01',1,'Eigen::ComplexSchur::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#afed8177cf9836f032d42bdb6c6bc6e01',1,'ComplexSchur< MatrixType >::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a54838a2e31e53bbe4dcb78b5e80c8484',1,'Eigen::LDLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a18a390f085567e650e8345cc7e7c0df8',1,'Eigen::LLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a85622ccbecff99c8933d21f0a22b22bb',1,'Eigen::RealSchur::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a85622ccbecff99c8933d21f0a22b22bb',1,'RealSchur< MatrixType >::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#ab486c0cd928c8b0c1c20c314f0963ad0',1,'Eigen::SimplicialLDLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a173073880c5fc17661b4505259de4aa1',1,'Eigen::SimplicialLLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a5aa9a62f8d2c593a5817f4bc77c3e276',1,'Eigen::SparseLU::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#afc7fe1546b0f6e1801b86f22f5664cb8',1,'Eigen::SVDBase::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#afc7fe1546b0f6e1801b86f22f5664cb8',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::matrixU()']]], - ['matrixv_107',['matrixV',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a245a453b5e7347f737295c23133238c4',1,'Eigen::SVDBase::matrixV()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a245a453b5e7347f737295c23133238c4',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::matrixV()']]], - ['matrixz_108',['matrixZ',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a4cd178f13aefe5189d4beeb3eb1c5897',1,'Eigen::CompleteOrthogonalDecomposition::matrixZ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a19a116383f11423179b4d8f316da6f67',1,'Eigen::RealQZ::matrixZ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a19a116383f11423179b4d8f316da6f67',1,'RealQZ< MatrixType >::matrixZ()']]], - ['matsize_109',['MatSize',['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a5e739605f00e00e40d5c0dca366c3fcd',1,'cv::MatSize']]], - ['matstep_110',['MatStep',['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a3ad7985df6dfb840590bb1442ed36e50',1,'cv::MatStep::MatStep()'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#ad38cde803142727c157a4b8050de2a16',1,'cv::MatStep::MatStep(size_t s)']]], - ['mattouiimage_111',['MatToUIImage',['https://docs.opencv.org/4.2.0/d2/d92/group__imgcodecs__ios.html#ga99a095c2334fd8bf933382f1cad12416',1,]]], - ['matx_112',['Matx',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'cv::Matx::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'cv::Matx::Matx(_Tp v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'cv::Matx::Matx(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13, _Tp v14, _Tp v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'cv::Matx::Matx(const _Tp *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'cv::Matx::Matx(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'cv::Matx::Matx(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'cv::Matx::Matx(const Matx< _Tp, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< _Tp, cn, 1 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13, _Tp v14, _Tp v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< _Tp, cn, 1 >::Matx(const _Tp *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< _Tp, cn, 1 >::Matx(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 1, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 1, 3 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 1, 3 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 1, 3 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 1, 3 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 1, 3 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 2, 2 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 2, 2 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 2, 2 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 2, 2 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 2, 2 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 2, 2 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 2, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 2, 3 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 2, 3 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 2, 3 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 2, 3 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 2, 3 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 3, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 3, 3 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 3, 3 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 3, 3 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 3, 3 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 3, 3 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 3, 4 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 3, 4 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 3, 4 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 3, 4 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 3, 4 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 3, 4 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 4, 4 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 4, 4 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 4, 4 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 4, 4 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 4, 4 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 4, 4 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, cn, 1 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, cn, 1 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, cn, 1 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, cn, 1 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, cn, 1 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, cn, 1 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float, 2, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float, 2, 3 >::Matx(float v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float, 2, 3 >::Matx(float v0, float v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13, float v14, float v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float, 2, 3 >::Matx(const float *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float, 2, 3 >::Matx(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, l > &a, const Matx< float, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float, 2, 3 >::Matx(const Matx< float, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float, 3, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float, 3, 3 >::Matx(float v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float, 3, 3 >::Matx(float v0, float v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13, float v14, float v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float, 3, 3 >::Matx(const float *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float, 3, 3 >::Matx(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, l > &a, const Matx< float, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float, 3, 3 >::Matx(const Matx< float, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float, cn, 1 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float, cn, 1 >::Matx(float v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float, cn, 1 >::Matx(float v0, float v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13, float v14, float v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float, cn, 1 >::Matx(const float *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float, cn, 1 >::Matx(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, l > &a, const Matx< float, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float, cn, 1 >::Matx(const Matx< float, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float_type, 4, 4 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float_type, 4, 4 >::Matx(float_type v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9, float_type v10, float_type v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9, float_type v10, float_type v11, float_type v12, float_type v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9, float_type v10, float_type v11, float_type v12, float_type v13, float_type v14, float_type v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float_type, 4, 4 >::Matx(const float_type *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float_type, 4, 4 >::Matx(std::initializer_list< float_type >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, l > &a, const Matx< float_type, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, n, m > &a, Matx_TOp)']]], - ['matxcommainitializer_113',['MatxCommaInitializer',['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#ad6172873d5585f6f43d6c116739c3046',1,'cv::MatxCommaInitializer::MatxCommaInitializer()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#ad6172873d5585f6f43d6c116739c3046',1,'MatxCommaInitializer< _Tp, m, 1 >::MatxCommaInitializer()']]], - ['max_114',['max',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6dff8b6e9105b6d817b493e7be157c90',1,'cv::MatExpr::max(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0326ec178e9d4ca09c54b6b488fb8021',1,'cv::MatExpr::max(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4a2fa0a37cba3f21b576ae4084757fba',1,'cv::MatExpr::max(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acb1ea96bb76c4014c399ef6ba536a7b0',1,'cv::MatExpr::max(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8ee69a65a23b73a176ab5ef9a6e5d5cb',1,'cv::MatExpr::max(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6dff8b6e9105b6d817b493e7be157c90',1,'cv::MatExpr::max(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0326ec178e9d4ca09c54b6b488fb8021',1,'cv::MatExpr::max(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4a2fa0a37cba3f21b576ae4084757fba',1,'cv::MatExpr::max(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acb1ea96bb76c4014c399ef6ba536a7b0',1,'cv::MatExpr::max(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8ee69a65a23b73a176ab5ef9a6e5d5cb',1,'cv::MatExpr::max(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/da/d81/structcv_1_1cudev_1_1numeric__limits_3_01bool_01_4.html#ac703275292abf4e807a214591bcdc2d8',1,'cv::cudev::numeric_limits< bool >::max()'],['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html#a975e4945dd32c2d4d81754a930de6b32',1,'cv::cudev::numeric_limits< double >::max()'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html#a4c00407dc7ea3ba6b40e4304029889a2',1,'cv::cudev::numeric_limits< float >::max()'],['https://docs.opencv.org/4.2.0/da/d4e/structcv_1_1cudev_1_1numeric__limits_3_01schar_01_4.html#aa062933ff7ca9cac2696d885e0a395eb',1,'cv::cudev::numeric_limits< schar >::max()'],['https://docs.opencv.org/4.2.0/d1/d8b/structcv_1_1cudev_1_1numeric__limits_3_01short_01_4.html#a20f0d37fa674c928c9511f6862a0cb4e',1,'cv::cudev::numeric_limits< short >::max()'],['https://docs.opencv.org/4.2.0/d3/dc7/structcv_1_1cudev_1_1numeric__limits_3_01uchar_01_4.html#a5ca8ea65e60c6da8c38058728816a00b',1,'cv::cudev::numeric_limits< uchar >::max()'],['https://docs.opencv.org/4.2.0/dd/d89/structcv_1_1cudev_1_1numeric__limits_3_01uint_01_4.html#a1a620ff9c217ea83b33e76a4402c59d9',1,'cv::cudev::numeric_limits< uint >::max()'],['https://docs.opencv.org/4.2.0/df/d47/structcv_1_1cudev_1_1numeric__limits_3_01ushort_01_4.html#a03563b99fdf8162fb1bdd44f26dce122',1,'cv::cudev::numeric_limits< ushort >::max()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3d08b6f078ecee3862aeb01bdf0ba8b9',1,'cv::softdouble::max()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6361d683afa3e472e06a0c2e80984f00',1,'cv::softfloat::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ae00d7ad063d15bb7162da61116552175',1,'gamma_distribution< double >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ae00d7ad063d15bb7162da61116552175',1,'gamma_distribution< result_type >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8e9cd7d4bb14de188ead958d3f1faeac',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae433f04f988a93f6e835d7cf7fbbde31',1,'normal_distribution< double >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae433f04f988a93f6e835d7cf7fbbde31',1,'normal_distribution< result_type >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#a14712b344c9472eb67d2973589ddf7f2',1,'std::bernoulli_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a3699dfeea620a15824d48f712df52b0c',1,'std::binomial_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#ae5cd7dd82c78d0383e64cd19e0234c86',1,'std::cauchy_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#ab4889a7bcb116a19e0815cf2fa250263',1,'std::chi_squared_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a9a70eb71021b6dd2b675e158d76833ef',1,'std::discard_block_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a3e8e124e8cdf1f8d18b1838a5d1c9728',1,'std::discrete_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#ac4d57abc4ee818a817139259105ef090',1,'std::exponential_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#ade74f06d6ad6c6f14c988fea1b63c1bb',1,'std::extreme_value_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a06d2101e5cda9129c6632e788fe7b9b8',1,'std::fisher_f_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ae00d7ad063d15bb7162da61116552175',1,'std::gamma_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a537ddec1681bac5e12dd0aab79983072',1,'std::geometric_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#abf1815a0f69ac213aeeac81d614371e2',1,'std::independent_bits_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#af334bf0422c2d5ef522e3dac8427d63a',1,'std::linear_congruential_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#ae51c9700b0c6168babb2abdf188e50d0',1,'std::lognormal_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8e9cd7d4bb14de188ead958d3f1faeac',1,'std::mersenne_twister_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#ab6d71a4f655a8dc7b6c15f86eed3c497',1,'std::negative_binomial_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae433f04f988a93f6e835d7cf7fbbde31',1,'std::normal_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#a27b481b529885d1b1b714c7fe69a1945',1,'std::numeric_limits::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a343aaa0cdc636a60b6e224055d9df438',1,'std::piecewise_constant_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a469645104ba3c002ed9ca944110dfe2a',1,'std::piecewise_linear_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#aaba081a4614ee3ff72039cae6a476267',1,'std::poisson_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a1d0bd67aff4969f4a202719edd2c4f5b',1,'std::shuffle_order_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a3aa9a19c585c414c605558b3af9a86ec',1,'std::student_t_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#aeea39effc4518e2236214b51cc0e9f93',1,'std::subtract_with_carry_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#aa54fab480296167c634342e2f0222ef7',1,'std::uniform_int_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#aa66df100cde48499a2ba6b2cca3d1554',1,'std::uniform_real_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4e66ea69757ab2d6193e385c919e6f71',1,'std::valarray::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#ab2f82c4a4ca1feff71630626710d865e',1,'std::weibull_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4e66ea69757ab2d6193e385c919e6f71',1,'valarray< size_t >::max()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a0e0a35eb40a9079468f447c1bab8a400',1,'Eigen::AlignedBox::max()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a987d516532b24fcadc34d2f501579c73',1,'Eigen::AlignedBox::max() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga78f988f6cfa6223610298cbd4f86ec66',1,'cv::max(const softfloat &a, const softfloat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga07f4a159313983528c74d5162a56fbc9',1,'cv::max(const softdouble &a, const softdouble &b)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gacc40fa15eac0fb83f8ca70b7cc0b588d',1,'cv::max(InputArray src1, InputArray src2, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad81c37ed0b0fd23ede0cefadbf04af44',1,'cv::max(const Mat &src1, const Mat &src2, Mat &dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6eefd595055bf1ea4ba3d12f70531511',1,'cv::max(const UMat &src1, const UMat &src2, UMat &dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gadb5dd3d870f10c0866035755b929b1e7',1,'cv::cuda::max()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7edae1e0cfcb34a59e251c9b330949',1,'cv::cudev::max(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff9681cddad025c92c98529215adacb',1,'cv::cudev::max(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6432d74919e90dbda4727df485d68878',1,'cv::cudev::max(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae250eaed4ac6113528a0590afe45b099',1,'cv::cudev::max(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bd06dc616da56d71d6f238772e921e',1,'cv::cudev::max(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd2a8c631c77af12548b22aaacebc87a',1,'cv::cudev::max(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf5c19898fc50d657385caeca1ca1ede',1,'cv::cudev::max(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3763f4140dbd3501a732882e48c5102c',1,'cv::cudev::max(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8946999942e013d38872e231417093a0',1,'cv::cudev::max(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db3b60a0cbe9bc77ad3e698954a9c18',1,'cv::cudev::max(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga634efcb854017039414da832695a2533',1,'cv::cudev::max(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4adf20946d2403cdc84854e778d03a9a',1,'cv::cudev::max(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9c563261c87743c5dab045a91a61c7c',1,'cv::cudev::max(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae17404884a5f0ef7eaf56225fb604fe6',1,'cv::cudev::max(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ce2d615591426d5adb4764996698b9',1,'cv::cudev::max(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bf33fe22d6e7efb9e5faacbba1c6a45',1,'cv::cudev::max(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf91add376317b3731608216f28ab963',1,'cv::cudev::max(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0053e35915c820454ea2264d4ee7613f',1,'cv::cudev::max(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62698a80e29b75ec8505358a3799936e',1,'cv::cudev::max(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bce6ab7cccef843a7c944bbdbf63b07',1,'cv::cudev::max(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b384425584ac7c2d34bdc057e5af65',1,'cv::cudev::max(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d199235971dff02dc2959f563d23308',1,'cv::cudev::max(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga327485d656538e5fa100c599c75a1e00',1,'cv::cudev::max(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a96f99c184fabb74382774232aa3a34',1,'cv::cudev::max(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1015f0bfdd3bb605e0e9d1fd147e1df4',1,'cv::cudev::max(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bd5ed74854a11a09051de2954f15ed5',1,'cv::cudev::max(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e265a5d6affec6d1afbd2ef5f14e06',1,'cv::cudev::max(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa886e0915a0f68093092573066797ad',1,'cv::cudev::max(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49797f16c920f5d36c3174510dec72ea',1,'cv::cudev::max(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70201802b3cf2254a774fcd6a556772c',1,'cv::cudev::max(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6460dd389b726df9bb0a7bcfbdc759de',1,'cv::cudev::max(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76dd5f19b86e2c63bbd784ce53d8c3d5',1,'cv::cudev::max(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20343d119b1183a8e2c86859ebf509a0',1,'cv::cudev::max(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17935472e8616fd215d00f74958ff148',1,'cv::cudev::max(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5ac8be6bbe25ea472a8b035ca898d4',1,'cv::cudev::max(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cf8fa19265b62e66cabe413af3e98af',1,'cv::cudev::max(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga365449d2ee70ebad2e967ded65012d9f',1,'cv::cudev::max(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe20c764e1d3494e66d66bb79edd752b',1,'cv::cudev::max(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6908e25c314e9a522c4b81cd3b11b0e6',1,'cv::cudev::max(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabea3829667cf61d6d87ff887a0b62656',1,'cv::cudev::max(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f137995b4f2d9eb06126a5cfdd0b50',1,'cv::cudev::max(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga108f8c6df21015b48c0599f93404be91',1,'cv::cudev::max(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb469b3fb7117158fcfab61b99dd18fa',1,'cv::cudev::max(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0acbba9ca0c69f0393eb530b2f3086dc',1,'cv::cudev::max(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f53bfb32250efe690ddf916e22abc28',1,'cv::cudev::max(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74726357f2915b6368219138b4025fcc',1,'cv::cudev::max(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13b69add5d5f7e0a7b08d70c58628078',1,'cv::cudev::max(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea3eb5bf693497dea32ded82af090fdd',1,'cv::cudev::max(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae109b4e7ada4529f21451575bd6abeb7',1,'cv::cudev::max(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga590088e5ce5ec5e4ed714b4cce952e7f',1,'cv::cudev::max(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31b2a6f5dd43d410fd15868e6c0f280a',1,'cv::cudev::max(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99cb5e202087eaa0b229d3cf230728d1',1,'cv::cudev::max(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb8f76636a19b20fcb0210361532c2c',1,'cv::cudev::max(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095daa3a23199e024436979238b6bbd',1,'cv::cudev::max(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga813e1d83b09e82844b86d1353a77d748',1,'cv::cudev::max(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3cb3bca7308191b5700f530fa34ca',1,'cv::cudev::max(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d59e76ba65008f3b6b6b24b94d29ef',1,'cv::cudev::max(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3448076586183d18e39c7974dd70c8',1,'cv::cudev::max(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b97852d88c33eb05ee8831f2092012f',1,'cv::cudev::max(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12a59c2315768e81cd56da5cae21f33c',1,'cv::cudev::max(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c50fae74b2eaf9f75402c6f3f815b4',1,'cv::cudev::max(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e080dce49fa6b5ea358a2258bb629c6',1,'cv::cudev::max(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga024f510b15b88ba5c7424f3d491e75b7',1,'cv::cudev::max(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fc9392d7d60b78635d0c74636408fa6',1,'cv::cudev::max(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2097bf067a2cd8b1fb3ca5a314002c34',1,'cv::cudev::max(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21d3728ff2ae2aa507b6126bbdd1504a',1,'cv::cudev::max(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae35a8be3fd1df938eb2434db4ff5d6e1',1,'cv::cudev::max(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52c58c71c1b59d7072442a8bd2b47bce',1,'cv::cudev::max(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a9e142727b6a1dda24772209649785',1,'cv::cudev::max(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8f9e1e0e8752a30a78603922dc17e01',1,'cv::cudev::max(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga611a70849906e1ae3c0aa9e756cfb8de',1,'cv::cudev::max(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57333c18e7c065708d6ac3a6f68f6df3',1,'cv::cudev::max(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7da28fa160b61ce66315922672f10592',1,'cv::cudev::max(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7415c5b61082b4b9c7c2122f269a1e60',1,'cv::cudev::max(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga226f005c8e0685c696bc3b340f2913a3',1,'cv::cudev::max(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7e33b43b4a4e457011d464eb94a5d96',1,'cv::cudev::max(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8288851d3304269c3ff9ae788264de83',1,'cv::cudev::max(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea853b43ad12529c0afecebe3e75f33a',1,'cv::cudev::max(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa798788a3437d78a74ca1dc04e4b832e',1,'cv::cudev::max(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga984b7fb4be9bcb23c751e79824907172',1,'cv::cudev::max(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2ae1b02759bc502a2f9f0e1918fa61c',1,'cv::cudev::max(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09d4d1ecf2a01d8a04bfb6faed58ca75',1,'cv::cudev::max(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ffe50e3856a9c0ef216c9c2cc8ef88',1,'cv::cudev::max(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ef1167e26453336dfc63d860a92f2',1,'cv::cudev::max(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga054b13d0e5d1196e5c64aeafc35eda9d',1,'cv::cudev::max(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b7e9961d85c9275ca9797e2a7d492b',1,'cv::cudev::max(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cc953644000cdd73756355d21f65035',1,'cv::cudev::max(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga798df13ec7d9c0bfd7e87e9205fbe20e',1,'cv::cudev::max(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0d3731aadd1cd52d1497476d249c411',1,'cv::cudev::max(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12ed50409cb498ca954657e6d56e0aef',1,'cv::cudev::max(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03bdb4845489b77a0ec85e7db2116d8b',1,'cv::cudev::max(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b0eef253e07a5d3c8eb891aa0150ab4',1,'cv::cudev::max(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac81a538d91716632a351a3315bb27a',1,'cv::cudev::max(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a344c714483b3b153d094e38ab69ab',1,'cv::cudev::max(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc2afd9d000eb685e979e691c41efd8',1,'cv::cudev::max(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6417ca2883d855805c090de4b04a92cf',1,'cv::cudev::max(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ad7e5cdef23ce3709ab800afdab3a6',1,'cv::cudev::max(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae90057ec7319796e7dcfd7af28027386',1,'cv::cudev::max(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga057d8e2732db88e8f676b2f638127717',1,'cv::cudev::max(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cf8fba0ece505e1b05405af25c6de92',1,'cv::cudev::max(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga464718ee489ad5f8e1c9b575e510dec0',1,'cv::cudev::max(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c5c137d283d4daacfba1473b10b5541',1,'cv::cudev::max(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2082fcc1d0c81f321f78c10583f9e088',1,'cv::cudev::max(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0f9db015b2f6295ac50e0981442eccf',1,'cv::cudev::max(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d3a74e6af64be7dfeffbc8242c24c21',1,'cv::cudev::max(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfc39d6227d9b78470d511a20f948807',1,'cv::cudev::max(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d901c104487bf31776724581aac418a',1,'cv::cudev::max(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e805de45dbf65b56e332ac2b64bc8c8',1,'cv::cudev::max(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3642852f0e37cc6b223048baedb89b23',1,'cv::cudev::max(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8954cb6a927557a3afcbe7f53a47d0f',1,'cv::cudev::max(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f2ab33db68c0db0ea3490da34d41f6',1,'cv::cudev::max(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9b2181ee4a6be9ea8de2da75f821d4b',1,'cv::cudev::max(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8a6a48caa4e6ec56a6df3cbf6ee88ad',1,'cv::cudev::max(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4114f5fa4b6a1defced1ff6f09e99a77',1,'cv::cudev::max(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga709da4137ee804a37a3bf9897f81a54f',1,'cv::cudev::max(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga745f7c1a67b75924005059bdadfad059',1,'cv::cudev::max(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23cd6e3768da75d63ee2c772721547b5',1,'cv::cudev::max(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3535e57152bb9bb870cc80641924d968',1,'cv::cudev::max(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac75fd5ed788efc158eadfad05909768b',1,'cv::cudev::max(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bc01dd4cae5bc8f5d0fbbe41894e38c',1,'cv::cudev::max(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedb902f8f075950428f149f3ae6e8368',1,'cv::cudev::max(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42077dd2a8bbd9426871e1e6100bb88a',1,'cv::cudev::max(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c461a61928c807cfcbb35e05328a9f',1,'cv::cudev::max(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53b91c1178649b59ce12e5b7e3cd9f3b',1,'cv::cudev::max(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78ce5713c65e22a601075d719a9c78bc',1,'cv::cudev::max(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c69369e7994b7c797c2c7e251111d3',1,'cv::cudev::max(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf02f0270ebf0e09528142c25810f089e',1,'cv::cudev::max(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7cf77af63bb9be60fbe892722e899',1,'cv::cudev::max(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga016da0e12302e3a9a75ac629fd4711a6',1,'cv::cudev::max(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab90a61e27bbf62122d6d1630791f69e0',1,'cv::cudev::max(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0052ef1d3ba6d7a3b9ab72ca6527a9d0',1,'cv::cudev::max(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga833b26b174d46e6eb2983a845389f414',1,'cv::cudev::max(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f23d4191d045b10de43a72d2b9e2ab',1,'cv::cudev::max(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b690732c1fc4757ef340044ecfc4489',1,'cv::cudev::max(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe962f22e136477e81f50bfe84c27369',1,'cv::cudev::max(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ee23973c69d923d4dc293194ced992',1,'cv::cudev::max(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e1f15f8dd8f0672a29b786211703d3e',1,'cv::cudev::max(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9860c259c810cab9f11ca560b7ed50',1,'cv::cudev::max(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32870871b640f6b22406ec31171a7316',1,'cv::cudev::max(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad63be246086568453d852849a3323420',1,'cv::cudev::max(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20aac3e422e4cb8c3b7e5e70c1d14423',1,'cv::cudev::max(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc21c02538e0d716e033a0f60bd07ed7',1,'cv::cudev::max(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa8424d806478f3ec1226b9de554a54',1,'cv::cudev::max(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0427ef988e84eb62ff762dc5ece814c6',1,'cv::cudev::max(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc917089df0cae9685a241d7410d0d37',1,'cv::cudev::max(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed2f554315d00fe5e6787519fa821c7',1,'cv::cudev::max(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b345faefa99feef763db27ada3d285',1,'cv::cudev::max(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga602d4e347cb5bb2d3e0eacc8a185ab64',1,'cv::cudev::max(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a9f8491e0461da68dacc563649708c',1,'cv::cudev::max(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafb5251a655b274d9ad94130f58de64c',1,'cv::cudev::max(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab87360125776b39906941203e1b01988',1,'cv::cudev::max(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8116d6776ef06f4ce0decc7e25bb5471',1,'cv::cudev::max(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d496f6f0b4656db91a8ca8e6c533c9',1,'cv::cudev::max(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13bcfe8e2f5abff4acd6bb4b2f600d77',1,'cv::cudev::max(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga936cf9ff339de81e4c74b518a0356fed',1,'cv::cudev::max(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1a4045b1aba6742c364d17b98249ce6',1,'cv::cudev::max(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0149a2b69e6f49dc2138fbce981230b',1,'cv::cudev::max(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf93df076678da531781417d10b9cbbf',1,'cv::cudev::max(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db835d025ae8e27f82dc4c951e54bef',1,'cv::cudev::max(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9a1fdaaac965358a6f82c190302c6bf',1,'cv::cudev::max(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fbfaa00be80acd28eea2d9597ef58fc',1,'cv::cudev::max(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfbe7499b071b13a107e80a187b44e18',1,'cv::cudev::max(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79aa095d6cb5bcf6580bdf2766f33ab9',1,'cv::cudev::max(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf786b3d507ec79af09f1ff37fa58525',1,'cv::cudev::max(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga371a082668f40b2910437b066d610194',1,'cv::cudev::max(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3dda6876d0ddb4a6cc7a91c52d76c08',1,'cv::cudev::max(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7211b847fa77ba43a4274ddbc97ebd',1,'cv::cudev::max(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga620a0b36ae5d9f37970db813f4e8dad6',1,'cv::cudev::max(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7ddc4d5890f821cb280d7425ce5c74',1,'cv::cudev::max(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8f397fce7b658287fd0719a7197036',1,'cv::cudev::max(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81a2eeb9b0dc3148e6e93b297fe4e7e0',1,'cv::cudev::max(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga475f92091db274dbbb70a7706d0d0c40',1,'cv::cudev::max(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga859fcb1f96519a0148e0286f77a98569',1,'cv::cudev::max(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4e298eee324f7998e2f9ad32fdc362',1,'cv::cudev::max(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fa4a50a11b12e71a4b5971db09daed7',1,'cv::cudev::max(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29fd18d8e44839d3003b25e7c2be9f88',1,'cv::cudev::max(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga432a2fa36fadc150cd6a2b953e68362e',1,'cv::cudev::max(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a0a22941a27212e0a2ce3ced4b6ce23',1,'cv::cudev::max(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37c1b4a34f412f4f9a3b151f13a73db0',1,'cv::cudev::max(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86216fa87809ccfc51828718c5c42431',1,'cv::cudev::max(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3ab9e4e16dc195499a754530f4e7696',1,'cv::cudev::max(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3caf6dbeefcc40b730b67f8a21584d47',1,'cv::cudev::max(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65ff60ad91763997812d3721ff9b4ce9',1,'cv::cudev::max(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0cd4e99dd1837208bb030e4de8239ba',1,'cv::cudev::max(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec0cfaea38a71f6439a84dd49181e73d',1,'cv::cudev::max(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73baf05ed230e047e8b1a4a2cc883168',1,'cv::cudev::max(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6e726e28a344d15ba4f74e9b3a624bf',1,'cv::cudev::max(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39231493f16b86d7850dde970bfc35de',1,'cv::cudev::max(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6c1b774c5b7a8e2dfd6f4ebb46329ab',1,'cv::cudev::max(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628a75ac09a15e078f60b2ff10091794',1,'cv::cudev::max(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8833c4e522d0818abcfbaed896c9830',1,'cv::cudev::max(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7feb89effc24d3e37cd28dbe3e7b645',1,'cv::cudev::max(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga727b7d3d95fff67e0a602255e3b31f1f',1,'cv::cudev::max(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga097408aee5dc871470963d6f0a1ff929',1,'cv::cudev::max(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e3c84204b34ce3d42a85a20fe00a57c',1,'cv::cudev::max(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e0f041f44d4dfe49cfd4b47a3f82377',1,'cv::cudev::max(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaac935d91a102285989be110a5acfeb',1,'cv::cudev::max(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9ab71229973969fae54bd11d59236e6',1,'cv::cudev::max(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad143763f595cbe3d51d5d0e024939f4c',1,'cv::cudev::max(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac468f9c2a30559c3c66a33fa44eb0618',1,'cv::cudev::max(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga0ff081ea80eb39a96389c16ac0f9e944',1,'cv::gapi::max()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gacc40fa15eac0fb83f8ca70b7cc0b588d',1,'max(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad81c37ed0b0fd23ede0cefadbf04af44',1,'max(const Mat &src1, const Mat &src2, Mat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6eefd595055bf1ea4ba3d12f70531511',1,'max(const UMat &src1, const UMat &src2, UMat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6361d683afa3e472e06a0c2e80984f00',1,'max()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga78f988f6cfa6223610298cbd4f86ec66',1,'max(const softfloat &a, const softfloat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga07f4a159313983528c74d5162a56fbc9',1,'max(const softdouble &a, const softdouble &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga0ff081ea80eb39a96389c16ac0f9e944',1,'max(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gadb5dd3d870f10c0866035755b929b1e7',1,'max(InputArray src1, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7edae1e0cfcb34a59e251c9b330949',1,'max(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff9681cddad025c92c98529215adacb',1,'max(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6432d74919e90dbda4727df485d68878',1,'max(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae250eaed4ac6113528a0590afe45b099',1,'max(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bd06dc616da56d71d6f238772e921e',1,'max(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd2a8c631c77af12548b22aaacebc87a',1,'max(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf5c19898fc50d657385caeca1ca1ede',1,'max(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3763f4140dbd3501a732882e48c5102c',1,'max(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8946999942e013d38872e231417093a0',1,'max(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db3b60a0cbe9bc77ad3e698954a9c18',1,'max(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga634efcb854017039414da832695a2533',1,'max(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4adf20946d2403cdc84854e778d03a9a',1,'max(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9c563261c87743c5dab045a91a61c7c',1,'max(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae17404884a5f0ef7eaf56225fb604fe6',1,'max(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ce2d615591426d5adb4764996698b9',1,'max(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bf33fe22d6e7efb9e5faacbba1c6a45',1,'max(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf91add376317b3731608216f28ab963',1,'max(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0053e35915c820454ea2264d4ee7613f',1,'max(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62698a80e29b75ec8505358a3799936e',1,'max(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bce6ab7cccef843a7c944bbdbf63b07',1,'max(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b384425584ac7c2d34bdc057e5af65',1,'max(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d199235971dff02dc2959f563d23308',1,'max(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga327485d656538e5fa100c599c75a1e00',1,'max(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a96f99c184fabb74382774232aa3a34',1,'max(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1015f0bfdd3bb605e0e9d1fd147e1df4',1,'max(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bd5ed74854a11a09051de2954f15ed5',1,'max(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e265a5d6affec6d1afbd2ef5f14e06',1,'max(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa886e0915a0f68093092573066797ad',1,'max(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49797f16c920f5d36c3174510dec72ea',1,'max(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70201802b3cf2254a774fcd6a556772c',1,'max(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6460dd389b726df9bb0a7bcfbdc759de',1,'max(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76dd5f19b86e2c63bbd784ce53d8c3d5',1,'max(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20343d119b1183a8e2c86859ebf509a0',1,'max(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17935472e8616fd215d00f74958ff148',1,'max(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5ac8be6bbe25ea472a8b035ca898d4',1,'max(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cf8fa19265b62e66cabe413af3e98af',1,'max(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga365449d2ee70ebad2e967ded65012d9f',1,'max(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe20c764e1d3494e66d66bb79edd752b',1,'max(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6908e25c314e9a522c4b81cd3b11b0e6',1,'max(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabea3829667cf61d6d87ff887a0b62656',1,'max(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f137995b4f2d9eb06126a5cfdd0b50',1,'max(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga108f8c6df21015b48c0599f93404be91',1,'max(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb469b3fb7117158fcfab61b99dd18fa',1,'max(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0acbba9ca0c69f0393eb530b2f3086dc',1,'max(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f53bfb32250efe690ddf916e22abc28',1,'max(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74726357f2915b6368219138b4025fcc',1,'max(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13b69add5d5f7e0a7b08d70c58628078',1,'max(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea3eb5bf693497dea32ded82af090fdd',1,'max(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae109b4e7ada4529f21451575bd6abeb7',1,'max(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga590088e5ce5ec5e4ed714b4cce952e7f',1,'max(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31b2a6f5dd43d410fd15868e6c0f280a',1,'max(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99cb5e202087eaa0b229d3cf230728d1',1,'max(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb8f76636a19b20fcb0210361532c2c',1,'max(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095daa3a23199e024436979238b6bbd',1,'max(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga813e1d83b09e82844b86d1353a77d748',1,'max(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3cb3bca7308191b5700f530fa34ca',1,'max(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d59e76ba65008f3b6b6b24b94d29ef',1,'max(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3448076586183d18e39c7974dd70c8',1,'max(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b97852d88c33eb05ee8831f2092012f',1,'max(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12a59c2315768e81cd56da5cae21f33c',1,'max(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c50fae74b2eaf9f75402c6f3f815b4',1,'max(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e080dce49fa6b5ea358a2258bb629c6',1,'max(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga024f510b15b88ba5c7424f3d491e75b7',1,'max(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fc9392d7d60b78635d0c74636408fa6',1,'max(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2097bf067a2cd8b1fb3ca5a314002c34',1,'max(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21d3728ff2ae2aa507b6126bbdd1504a',1,'max(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae35a8be3fd1df938eb2434db4ff5d6e1',1,'max(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52c58c71c1b59d7072442a8bd2b47bce',1,'max(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a9e142727b6a1dda24772209649785',1,'max(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8f9e1e0e8752a30a78603922dc17e01',1,'max(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga611a70849906e1ae3c0aa9e756cfb8de',1,'max(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57333c18e7c065708d6ac3a6f68f6df3',1,'max(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7da28fa160b61ce66315922672f10592',1,'max(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7415c5b61082b4b9c7c2122f269a1e60',1,'max(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga226f005c8e0685c696bc3b340f2913a3',1,'max(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7e33b43b4a4e457011d464eb94a5d96',1,'max(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8288851d3304269c3ff9ae788264de83',1,'max(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea853b43ad12529c0afecebe3e75f33a',1,'max(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa798788a3437d78a74ca1dc04e4b832e',1,'max(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga984b7fb4be9bcb23c751e79824907172',1,'max(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2ae1b02759bc502a2f9f0e1918fa61c',1,'max(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09d4d1ecf2a01d8a04bfb6faed58ca75',1,'max(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ffe50e3856a9c0ef216c9c2cc8ef88',1,'max(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ef1167e26453336dfc63d860a92f2',1,'max(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga054b13d0e5d1196e5c64aeafc35eda9d',1,'max(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b7e9961d85c9275ca9797e2a7d492b',1,'max(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cc953644000cdd73756355d21f65035',1,'max(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga798df13ec7d9c0bfd7e87e9205fbe20e',1,'max(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0d3731aadd1cd52d1497476d249c411',1,'max(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12ed50409cb498ca954657e6d56e0aef',1,'max(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03bdb4845489b77a0ec85e7db2116d8b',1,'max(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b0eef253e07a5d3c8eb891aa0150ab4',1,'max(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac81a538d91716632a351a3315bb27a',1,'max(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a344c714483b3b153d094e38ab69ab',1,'max(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc2afd9d000eb685e979e691c41efd8',1,'max(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6417ca2883d855805c090de4b04a92cf',1,'max(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ad7e5cdef23ce3709ab800afdab3a6',1,'max(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae90057ec7319796e7dcfd7af28027386',1,'max(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga057d8e2732db88e8f676b2f638127717',1,'max(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cf8fba0ece505e1b05405af25c6de92',1,'max(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga464718ee489ad5f8e1c9b575e510dec0',1,'max(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c5c137d283d4daacfba1473b10b5541',1,'max(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2082fcc1d0c81f321f78c10583f9e088',1,'max(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0f9db015b2f6295ac50e0981442eccf',1,'max(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d3a74e6af64be7dfeffbc8242c24c21',1,'max(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfc39d6227d9b78470d511a20f948807',1,'max(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d901c104487bf31776724581aac418a',1,'max(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e805de45dbf65b56e332ac2b64bc8c8',1,'max(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3642852f0e37cc6b223048baedb89b23',1,'max(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8954cb6a927557a3afcbe7f53a47d0f',1,'max(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f2ab33db68c0db0ea3490da34d41f6',1,'max(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9b2181ee4a6be9ea8de2da75f821d4b',1,'max(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8a6a48caa4e6ec56a6df3cbf6ee88ad',1,'max(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4114f5fa4b6a1defced1ff6f09e99a77',1,'max(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga709da4137ee804a37a3bf9897f81a54f',1,'max(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga745f7c1a67b75924005059bdadfad059',1,'max(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23cd6e3768da75d63ee2c772721547b5',1,'max(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3535e57152bb9bb870cc80641924d968',1,'max(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac75fd5ed788efc158eadfad05909768b',1,'max(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bc01dd4cae5bc8f5d0fbbe41894e38c',1,'max(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedb902f8f075950428f149f3ae6e8368',1,'max(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42077dd2a8bbd9426871e1e6100bb88a',1,'max(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c461a61928c807cfcbb35e05328a9f',1,'max(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53b91c1178649b59ce12e5b7e3cd9f3b',1,'max(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78ce5713c65e22a601075d719a9c78bc',1,'max(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c69369e7994b7c797c2c7e251111d3',1,'max(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf02f0270ebf0e09528142c25810f089e',1,'max(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7cf77af63bb9be60fbe892722e899',1,'max(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga016da0e12302e3a9a75ac629fd4711a6',1,'max(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab90a61e27bbf62122d6d1630791f69e0',1,'max(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0052ef1d3ba6d7a3b9ab72ca6527a9d0',1,'max(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga833b26b174d46e6eb2983a845389f414',1,'max(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f23d4191d045b10de43a72d2b9e2ab',1,'max(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b690732c1fc4757ef340044ecfc4489',1,'max(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe962f22e136477e81f50bfe84c27369',1,'max(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ee23973c69d923d4dc293194ced992',1,'max(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e1f15f8dd8f0672a29b786211703d3e',1,'max(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9860c259c810cab9f11ca560b7ed50',1,'max(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32870871b640f6b22406ec31171a7316',1,'max(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad63be246086568453d852849a3323420',1,'max(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20aac3e422e4cb8c3b7e5e70c1d14423',1,'max(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc21c02538e0d716e033a0f60bd07ed7',1,'max(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa8424d806478f3ec1226b9de554a54',1,'max(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0427ef988e84eb62ff762dc5ece814c6',1,'max(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc917089df0cae9685a241d7410d0d37',1,'max(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed2f554315d00fe5e6787519fa821c7',1,'max(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b345faefa99feef763db27ada3d285',1,'max(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga602d4e347cb5bb2d3e0eacc8a185ab64',1,'max(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a9f8491e0461da68dacc563649708c',1,'max(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafb5251a655b274d9ad94130f58de64c',1,'max(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab87360125776b39906941203e1b01988',1,'max(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8116d6776ef06f4ce0decc7e25bb5471',1,'max(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d496f6f0b4656db91a8ca8e6c533c9',1,'max(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13bcfe8e2f5abff4acd6bb4b2f600d77',1,'max(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga936cf9ff339de81e4c74b518a0356fed',1,'max(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1a4045b1aba6742c364d17b98249ce6',1,'max(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0149a2b69e6f49dc2138fbce981230b',1,'max(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf93df076678da531781417d10b9cbbf',1,'max(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db835d025ae8e27f82dc4c951e54bef',1,'max(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9a1fdaaac965358a6f82c190302c6bf',1,'max(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fbfaa00be80acd28eea2d9597ef58fc',1,'max(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfbe7499b071b13a107e80a187b44e18',1,'max(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79aa095d6cb5bcf6580bdf2766f33ab9',1,'max(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf786b3d507ec79af09f1ff37fa58525',1,'max(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga371a082668f40b2910437b066d610194',1,'max(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3dda6876d0ddb4a6cc7a91c52d76c08',1,'max(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7211b847fa77ba43a4274ddbc97ebd',1,'max(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga620a0b36ae5d9f37970db813f4e8dad6',1,'max(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7ddc4d5890f821cb280d7425ce5c74',1,'max(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8f397fce7b658287fd0719a7197036',1,'max(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81a2eeb9b0dc3148e6e93b297fe4e7e0',1,'max(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga475f92091db274dbbb70a7706d0d0c40',1,'max(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga859fcb1f96519a0148e0286f77a98569',1,'max(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4e298eee324f7998e2f9ad32fdc362',1,'max(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fa4a50a11b12e71a4b5971db09daed7',1,'max(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29fd18d8e44839d3003b25e7c2be9f88',1,'max(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga432a2fa36fadc150cd6a2b953e68362e',1,'max(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a0a22941a27212e0a2ce3ced4b6ce23',1,'max(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37c1b4a34f412f4f9a3b151f13a73db0',1,'max(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86216fa87809ccfc51828718c5c42431',1,'max(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3ab9e4e16dc195499a754530f4e7696',1,'max(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3caf6dbeefcc40b730b67f8a21584d47',1,'max(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65ff60ad91763997812d3721ff9b4ce9',1,'max(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0cd4e99dd1837208bb030e4de8239ba',1,'max(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec0cfaea38a71f6439a84dd49181e73d',1,'max(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73baf05ed230e047e8b1a4a2cc883168',1,'max(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6e726e28a344d15ba4f74e9b3a624bf',1,'max(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39231493f16b86d7850dde970bfc35de',1,'max(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6c1b774c5b7a8e2dfd6f4ebb46329ab',1,'max(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628a75ac09a15e078f60b2ff10091794',1,'max(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8833c4e522d0818abcfbaed896c9830',1,'max(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7feb89effc24d3e37cd28dbe3e7b645',1,'max(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga727b7d3d95fff67e0a602255e3b31f1f',1,'max(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga097408aee5dc871470963d6f0a1ff929',1,'max(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e3c84204b34ce3d42a85a20fe00a57c',1,'max(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e0f041f44d4dfe49cfd4b47a3f82377',1,'max(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaac935d91a102285989be110a5acfeb',1,'max(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9ab71229973969fae54bd11d59236e6',1,'max(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad143763f595cbe3d51d5d0e024939f4c',1,'max(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac468f9c2a30559c3c66a33fa44eb0618',1,'max(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#aa05dc1fa1f8a513888fd311ea7b39aa3',1,'__gnu_parallel::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga84d30d8c4b3f2cbe8ec2055c34a578da',1,'std::max(const _Tp &__a, const _Tp &__b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga2a22232a7bcd3b1f87a45a5fb01ac9c3',1,'std::max(const _Tp &__a, const _Tp &__b, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4e66ea69757ab2d6193e385c919e6f71',1,'max() const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga84d30d8c4b3f2cbe8ec2055c34a578da',1,'max(const _Tp &__a, const _Tp &__b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga2a22232a7bcd3b1f87a45a5fb01ac9c3',1,'max(const _Tp &__a, const _Tp &__b, _Compare __comp)(Global Namespace)']]], - ['max16s_115',['max16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66336453cd904ddef80b325b92626610',1,'cv::hal::max16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66336453cd904ddef80b325b92626610',1,'max16s()(Global Namespace)']]], - ['max16u_116',['max16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga601826ce6352e8b85eb260be8b85c7a6',1,'cv::hal::max16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga601826ce6352e8b85eb260be8b85c7a6',1,'max16u()(Global Namespace)']]], - ['max32f_117',['max32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga4652f0687a917b049d22a466adb4c18e',1,'cv::hal::max32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga4652f0687a917b049d22a466adb4c18e',1,'max32f()(Global Namespace)']]], - ['max32s_118',['max32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6738c923e01c515b9c3be8329adf5494',1,'cv::hal::max32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6738c923e01c515b9c3be8329adf5494',1,'max32s()(Global Namespace)']]], - ['max64f_119',['max64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9283f7d52b658ea4c9b59652d9f0a173',1,'cv::hal::max64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9283f7d52b658ea4c9b59652d9f0a173',1,'max64f()(Global Namespace)']]], - ['max8s_120',['max8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacc4819891df74719567179051e911e2b',1,'cv::hal::max8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacc4819891df74719567179051e911e2b',1,'max8s()(Global Namespace)']]], - ['max8u_121',['max8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac92f2f18733b6f8ac7692da669252906',1,'cv::hal::max8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac92f2f18733b6f8ac7692da669252906',1,'max8u()(Global Namespace)']]], - ['max_5f_122',['max_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41470dd8d5f61c2020ab8672a483838',1,'cv::cudev::max_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41470dd8d5f61c2020ab8672a483838',1,'max_()(Global Namespace)']]], - ['max_5fbucket_5fcount_123',['max_bucket_count',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af29f5a18a09a36adb720b6907e45eacd',1,'std::unordered_map::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a193e48c36ac0f5888911cf991428a287',1,'std::unordered_multimap::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#abc4c192168d4217376439dce87cf12a2',1,'std::unordered_multiset::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#afc90e16afa79bd929b49590dc8637b00',1,'std::unordered_set::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af29f5a18a09a36adb720b6907e45eacd',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_bucket_count()']]], - ['max_5felement_124',['max_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6c310c6d1db64624d3097dd06838ef9b',1,'std::max_element(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gab0bc7a1a77eead2e4af61c6506230104',1,'std::max_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6c310c6d1db64624d3097dd06838ef9b',1,'max_element(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gab0bc7a1a77eead2e4af61c6506230104',1,'max_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], - ['max_5fload_5ffactor_125',['max_load_factor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae2f58d908f2e03656fce158550d9ba73',1,'std::unordered_map::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0584274b6378b6d962debbe96f5c5cb6',1,'std::unordered_map::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a72250fbcb87cc6ea4998eb8f00465650',1,'std::unordered_multimap::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#afea08a0d2315df4b6da1318c74be7114',1,'std::unordered_multimap::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a1d6af6a14a53c2709b072d6722ecf039',1,'std::unordered_multiset::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aff0cd0917d69025d995dd401c1ec63a6',1,'std::unordered_multiset::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ac182f2597af135950bfc3b1cd09575ec',1,'std::unordered_set::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a086929d624211470ff2b20a0ba23a86d',1,'std::unordered_set::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae2f58d908f2e03656fce158550d9ba73',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0584274b6378b6d962debbe96f5c5cb6',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_load_factor(float __z)']]], - ['max_5fsize_126',['max_size',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a5fdf0b0b785ed6eb4868aa5d587ead96',1,'cv::Allocator::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a29c306bcb6a7676a516430a0e50b990a',1,'__alloc_traits< _Tp_alloc_type >::max_size(const _Tp_alloc_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'__alloc_traits< _Tp_alloc_type >::max_size(const _Tp_alloc_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a29c306bcb6a7676a516430a0e50b990a',1,'__gnu_cxx::__alloc_traits::max_size(const _Alloc &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'__gnu_cxx::__alloc_traits::max_size(const _Alloc &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac8315ed08ac178584cf4a80ff4f7346a',1,'__gnu_cxx::__versa_string::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'__gnu_debug::basic_string::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'allocator_traits< _Tp_alloc_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< _CharT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< _CharT, _Traits, _Allocator >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< char >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< char, char_traits< char >, _Byte_alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< char_type, _Traits, _Alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< value_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5aea8252ed76805923d591f878768f67',1,'deque< _StateSeqT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac0642b1d26b07dcf28d5fd72bfbdd6d1',1,'list< __inp, __rebind_inp >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a586a8264c3ff903b6a2d66b245c3f88e',1,'match_results< _Bi_iter >::max_size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a586a8264c3ff903b6a2d66b245c3f88e',1,'match_results< _Bi_iter >::max_size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'std::allocator_traits::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a7d06983d84598768a8aa6458ac10738c',1,'std::allocator_traits< allocator< _Tp > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'std::basic_string::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5aea8252ed76805923d591f878768f67',1,'std::deque::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ae19c74808b1bc8e53bdc229fd3d389fa',1,'std::forward_list::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac0642b1d26b07dcf28d5fd72bfbdd6d1',1,'std::list::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#af2c022c3b246d7beb4c6eae4d6ce7ca2',1,'std::map::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a586a8264c3ff903b6a2d66b245c3f88e',1,'std::match_results::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a6c9a48e59ffb98b5afe9003861f1ddee',1,'std::multimap::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aec68936b69a9391df7ea268a7c44fb13',1,'std::multiset::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a84c5ddf1dff1dbdb8583cfabe3605b86',1,'std::set::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a70757335be624593a6bdf3c84d4895ee',1,'std::tr2::dynamic_bitset::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a695e48bcb2fa9e91ad07d3f7c45016dd',1,'std::unordered_map::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#accd0a24f61c8161dbd0fe216ead19142',1,'std::unordered_multimap::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af0cbbd14540e7875dd507533a959bf77',1,'std::unordered_multiset::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#afbad50ec9cd24208c2b33f35aa50f371',1,'std::unordered_set::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'std::vector::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a695e48bcb2fa9e91ad07d3f7c45016dd',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< __diff_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _CharClassT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _CharT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _Cmpt >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _Node *, _Nodeptr_Alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _RealType >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _State< _TraitsT::char_type > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _StringT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< block_type, allocator_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< Catalog_info * >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< double >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< int >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< result_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< size_t >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< std::pair< _BiIter, int > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< std::pair< _StateIdT, std::vector > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< std::pair< _StrTransT, _StrTransT > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< sub_match< _Bi_iter >, _Alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< sub_match< _BiIter >, _Alloc >::max_size()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a1b46c6631e30b8394e89bd1546d69736.html#a1b46c6631e30b8394e89bd1546d69736',1,'nlohmann::basic_json::max_size()']]], - ['maxclockfrequency_127',['maxClockFrequency',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2ad4a9905df7939ff4dbe1e1323155ef',1,'cv::ocl::Device']]], - ['maxcoeff_128',['maxCoeff',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'Eigen::DenseBase::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'Eigen::DenseBase::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'Eigen::DenseBase::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'DenseBase< ArrayWrapper< ExpressionType > >::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'DenseBase< ArrayWrapper< ExpressionType > >::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'DenseBase< ArrayWrapper< ExpressionType > >::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'DenseBase< Solve< Decomposition, RhsType > >::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'DenseBase< Solve< Decomposition, RhsType > >::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'DenseBase< Solve< Decomposition, RhsType > >::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'Eigen::VectorwiseOp::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Derived, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Derived, Vertical >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::maxCoeff()']]], - ['maxcomputeunits_129',['maxComputeUnits',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a8cdbedf915935b8a3de00abcf0ff9669',1,'cv::ocl::Device']]], - ['maxconstantargs_130',['maxConstantArgs',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a1ab0e68f5c0ab2daa578f0b408f71353',1,'cv::ocl::Device']]], - ['maxconstantbuffersize_131',['maxConstantBufferSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#aa5ce4c19f0b23e5cad7ad9e55aef2e0c',1,'cv::ocl::Device']]], - ['maxgridsize_132',['maxGridSize',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a0a1d357f595900f4ecdac350db7d672c',1,'cv::cuda::DeviceInfo']]], - ['maxiterations_133',['maxIterations',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a168a74c8dceb6233b220031fdd756ba0',1,'Eigen::IterativeSolverBase']]], - ['maxlevel_134',['maxLevel',['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html#aa1e49ada8bd3ff9eb22811a48ca3dc90',1,'cv::videostab::PyrLkOptFlowEstimatorBase']]], - ['maxmemallocsize_135',['maxMemAllocSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a43a7ce355911b326d286ecaab3fb2e30',1,'cv::ocl::Device']]], - ['maxparametersize_136',['maxParameterSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0878eb6f7c3b8d9043e46d73a00137f3',1,'cv::ocl::Device']]], - ['maxpivot_137',['maxPivot',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aac8c43d720170980f582d01494df9e8f',1,'Eigen::ColPivHouseholderQR::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aac8c43d720170980f582d01494df9e8f',1,'ColPivHouseholderQR< MatrixType >::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a5b712a58c13b7e5089be9228ec42f738',1,'Eigen::CompleteOrthogonalDecomposition::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a7887506237a3bf912aebc9aaa8edacec',1,'Eigen::FullPivHouseholderQR::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#abced9f280f5fc49c2e62605c782b237b',1,'Eigen::FullPivLU::maxPivot()']]], - ['maxreadimageargs_138',['maxReadImageArgs',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a5b3698f3adbd38f41531799ae54e1826',1,'cv::ocl::Device']]], - ['maxsamplers_139',['maxSamplers',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a88f1375b142fbed9b3fcf69ffd70289c',1,'cv::ocl::Device']]], - ['maxsize_140',['maxSize',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#abed50a3b4fb6efb9a9a05b7c55c0edc2',1,'INCVMemAllocator::maxSize()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#a312414baa9360f6a2928e5b8a4570e56',1,'NCVMemNativeAllocator::maxSize()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#a492aadf40fab71f92b24f679e9f6a677',1,'NCVMemStackAllocator::maxSize()']]], - ['maxsurface1d_141',['maxSurface1D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a260dccdd9395ca059b60d2c250a7b19d',1,'cv::cuda::DeviceInfo']]], - ['maxsurface1dlayered_142',['maxSurface1DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a2c6c2d86c79673e0f003f72999901e0b',1,'cv::cuda::DeviceInfo']]], - ['maxsurface2d_143',['maxSurface2D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a5c46713e52796df8de5cc0675545b591',1,'cv::cuda::DeviceInfo']]], - ['maxsurface2dlayered_144',['maxSurface2DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ab382770adf2533cf52a6ec8dfdeceefd',1,'cv::cuda::DeviceInfo']]], - ['maxsurface3d_145',['maxSurface3D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#add5a8209f3a0a244bca9ce602a3ca8b9',1,'cv::cuda::DeviceInfo']]], - ['maxsurfacecubemap_146',['maxSurfaceCubemap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a380277029eb0760f3cdd599fdd6d6a68',1,'cv::cuda::DeviceInfo']]], - ['maxsurfacecubemaplayered_147',['maxSurfaceCubemapLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a6d2514b8ea311750d6640cb0a09ee885',1,'cv::cuda::DeviceInfo']]], - ['maxtexture1d_148',['maxTexture1D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a7dadb9baaef83deb18a19340eff89efd',1,'cv::cuda::DeviceInfo']]], - ['maxtexture1dlayered_149',['maxTexture1DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a63595aa52127a5e101aa2bd05bf21213',1,'cv::cuda::DeviceInfo']]], - ['maxtexture1dlinear_150',['maxTexture1DLinear',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a6ca6a1f3ccffbe4bcd082bb051a84709',1,'cv::cuda::DeviceInfo']]], - ['maxtexture1dmipmap_151',['maxTexture1DMipmap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8400034f3a46ec994d5f0b2b3097994d',1,'cv::cuda::DeviceInfo']]], - ['maxtexture2d_152',['maxTexture2D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a99a188ab0931a15cd512a75e7fa448b5',1,'cv::cuda::DeviceInfo']]], - ['maxtexture2dgather_153',['maxTexture2DGather',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a91932040e2174937d7db801dc51e37e1',1,'cv::cuda::DeviceInfo']]], - ['maxtexture2dlayered_154',['maxTexture2DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a868a27580ea696306c83aa5da2fea496',1,'cv::cuda::DeviceInfo']]], - ['maxtexture2dlinear_155',['maxTexture2DLinear',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#afe9b3a92a9832c6a8f52f8a006b8f297',1,'cv::cuda::DeviceInfo']]], - ['maxtexture2dmipmap_156',['maxTexture2DMipmap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#abd1a87ff21e6ace392634e05403618b6',1,'cv::cuda::DeviceInfo']]], - ['maxtexture3d_157',['maxTexture3D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#aed437fa43c5294c1fbb3f909a535ca57',1,'cv::cuda::DeviceInfo']]], - ['maxtexturecubemap_158',['maxTextureCubemap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ab66a0f8545b5f2b0104c56fe1373451c',1,'cv::cuda::DeviceInfo']]], - ['maxtexturecubemaplayered_159',['maxTextureCubemapLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a7fa8dda4989ff180a91d2d55377eab56',1,'cv::cuda::DeviceInfo']]], - ['maxthreadsdim_160',['maxThreadsDim',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#acd6c9806faa5718ac6ce46cf7f94b1b0',1,'cv::cuda::DeviceInfo']]], - ['maxthreadsperblock_161',['maxThreadsPerBlock',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ac90a47955f85b4b9b082f6f211562aa9',1,'cv::cuda::DeviceInfo']]], - ['maxthreadspermultiprocessor_162',['maxThreadsPerMultiProcessor',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8f827f2c363f19c7167479793f246bfa',1,'cv::cuda::DeviceInfo']]], - ['maxval_5f_163',['maxVal_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84304ffdf1361fe076ec78d18d9b9e49',1,'cv::cudev::maxVal_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84304ffdf1361fe076ec78d18d9b9e49',1,'maxVal_()(Global Namespace)']]], - ['maxworkgroupsize_164',['maxWorkGroupSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#afd60a223663d5b4951d585e9f167d54f',1,'cv::ocl::Device']]], - ['maxworkitemdims_165',['maxWorkItemDims',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a6c76e7f57a273ea51e3564a4f1269158',1,'cv::ocl::Device']]], - ['maxworkitemsizes_166',['maxWorkItemSizes',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a693878609398a5edafad71026661e41f',1,'cv::ocl::Device']]], - ['maxwriteimageargs_167',['maxWriteImageArgs',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#afc62c78591b741fdca19a729867686ca',1,'cv::ocl::Device']]], - ['mctkernel_168',['MCTKernel',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a377cbc392538c3039bec7de2bb08f9cd',1,'cv::stereo::MCTKernel::MCTKernel()'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a84d81c259c0c425e804e8ecfa58e9970',1,'cv::stereo::MCTKernel::MCTKernel(uint8_t **images, int threshold)']]], - ['mean_169',['mean',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abcc6e9b8ff25f5d1e076cb5f51f42231',1,'normal_distribution< double >::mean()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abcc6e9b8ff25f5d1e076cb5f51f42231',1,'normal_distribution< result_type >::mean()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abcc6e9b8ff25f5d1e076cb5f51f42231',1,'std::normal_distribution::mean()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a92604e5687496c6efcc7148840fb478c',1,'std::poisson_distribution::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'Eigen::DenseBase::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'DenseBase< ArrayWrapper< ExpressionType > >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'DenseBase< Solve< Decomposition, RhsType > >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'Eigen::VectorwiseOp::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Derived, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Derived, Vertical >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::mean()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga191389f8a0e58180bb13a727782cd461',1,'cv::mean()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa37ea1b811bcc3e26ee1b3fb00acc55c',1,'cv::gapi::mean()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga191389f8a0e58180bb13a727782cd461',1,'mean(InputArray src, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa37ea1b811bcc3e26ee1b3fb00acc55c',1,'mean(const GMat &src)(Global Namespace)']]], - ['meanandvariancealongrows_170',['meanAndVarianceAlongRows',['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga10bf67ff702c28406312748f905863ec',1,'cv::sfm::meanAndVarianceAlongRows()'],['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga10bf67ff702c28406312748f905863ec',1,'meanAndVarianceAlongRows()(Global Namespace)']]], - ['meankernelintegralimage_171',['MeanKernelIntegralImage',['https://docs.opencv.org/4.2.0/de/d9b/classcv_1_1stereo_1_1MeanKernelIntegralImage.html#a4a35ad65bd56ee5110cde92a40bb6ca7',1,'cv::stereo::MeanKernelIntegralImage']]], - ['meanshift_172',['meanShift',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga432a563c94eaf179533ff1e83dbb65ea',1,'cv::meanShift()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga432a563c94eaf179533ff1e83dbb65ea',1,'meanShift()(Global Namespace)']]], - ['meanshiftfiltering_173',['meanShiftFiltering',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gae13b3035bc6df0e512d876dbb8c00555',1,'cv::cuda::meanShiftFiltering()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gae13b3035bc6df0e512d876dbb8c00555',1,'meanShiftFiltering()(Global Namespace)']]], - ['meanshiftproc_174',['meanShiftProc',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga6039dc8ecbe2f912bc83fcc9b3bcca39',1,'cv::cuda::meanShiftProc()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga6039dc8ecbe2f912bc83fcc9b3bcca39',1,'meanShiftProc()(Global Namespace)']]], - ['meanshiftsegmentation_175',['meanShiftSegmentation',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga70ed80533a448829dc48cf22b1845c16',1,'cv::cuda::meanShiftSegmentation()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga70ed80533a448829dc48cf22b1845c16',1,'meanShiftSegmentation()(Global Namespace)']]], - ['meanstddev_176',['meanStdDev',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga846c858f4004d59493d7c6a4354b301d',1,'cv::meanStdDev()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga990a4db4c6d7e8f0f3a6685ba48fbddc',1,'cv::cuda::meanStdDev(InputArray mtx, Scalar &mean, Scalar &stddev)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac0e8dc0bb32fda5afd32de0f18817587',1,'cv::cuda::meanStdDev(InputArray mtx, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga846c858f4004d59493d7c6a4354b301d',1,'meanStdDev(InputArray src, OutputArray mean, OutputArray stddev, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga990a4db4c6d7e8f0f3a6685ba48fbddc',1,'meanStdDev(InputArray mtx, Scalar &mean, Scalar &stddev)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac0e8dc0bb32fda5afd32de0f18817587',1,'meanStdDev(InputArray mtx, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], - ['measurementfunction_177',['measurementFunction',['https://docs.opencv.org/4.2.0/da/d2b/classcv_1_1tracking_1_1UkfSystemModel.html#ae8f272725272a23cc45dee75fb65349d',1,'cv::tracking::UkfSystemModel']]], - ['median1x9filter_178',['Median1x9Filter',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a4bdb66993689eb64dcb63f8b81c6046c',1,'cv::stereo::Matching']]], - ['median9x1filter_179',['Median9x1Filter',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#ac2a8d29abd0681427dbaac6819e88b11',1,'cv::stereo::Matching']]], - ['medianblur_180',['medianBlur',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga564869aa33e58769b4469101aac458f9',1,'cv::medianBlur()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga90c28c4986e8117ecb1b61300ff3e7e8',1,'cv::gapi::medianBlur()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga564869aa33e58769b4469101aac458f9',1,'medianBlur(InputArray src, OutputArray dst, int ksize)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga90c28c4986e8117ecb1b61300ff3e7e8',1,'medianBlur(const GMat &src, int ksize)(Global Namespace)']]], - ['mem_5ffn_181',['mem_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html#gadd917dd05154842bc6aebcf5c90abb7f',1,'std::mem_fn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html#gadd917dd05154842bc6aebcf5c90abb7f',1,'mem_fn()(Global Namespace)']]], - ['membaseaddralign_182',['memBaseAddrAlign',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ad13666f3a1309fd46afddeee390049d1',1,'cv::ocl::Device']]], - ['memoptypetostr_183',['memopTypeToStr',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga3a8b3c8a8991e15ac4e4aa2a007bb2ea',1,'cv::ocl::memopTypeToStr()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga3a8b3c8a8991e15ac4e4aa2a007bb2ea',1,'memopTypeToStr()(Global Namespace)']]], - ['memorybuswidth_184',['memoryBusWidth',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#adc029e9b7100063a9646a50435f55ed3',1,'cv::cuda::DeviceInfo']]], - ['memoryclockrate_185',['memoryClockRate',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a014f96fb7cd5639480347e7de85686be',1,'cv::cuda::DeviceInfo']]], - ['mempitch_186',['memPitch',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ac9923f30632f9a587a0d5f971fdfaf62',1,'cv::cuda::DeviceInfo']]], - ['memsegcopyhelper_187',['memSegCopyHelper',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga75faff2ec1d14c63918ee02e74e988cc',1,]]], - ['memsegcopyhelper2d_188',['memSegCopyHelper2D',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga253a695ab7a336ebb07008593565cd4c',1,]]], - ['memtype_189',['memType',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#af8070dc8c7faee07938281306cacf0c8',1,'INCVMemAllocator::memType()'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#a11fb3dc94bd7225421630e4491e226bb',1,'NCVMatrix::memType()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#af82dd02192ab82e59eb264a8c0aee539',1,'NCVMemNativeAllocator::memType()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#ae28f33a2fb00ad0f9e0ed4ba7d48bc34',1,'NCVMemStackAllocator::memType()'],['https://docs.opencv.org/4.2.0/dc/d73/classNCVVector.html#a6b686f2701af81ddd34aa121246bca01',1,'NCVVector::memType()']]], - ['mercatorwarper_190',['MercatorWarper',['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1detail_1_1MercatorWarper.html#a3db79c1c7a45176cd58da433556769c9',1,'cv::detail::MercatorWarper']]], - ['merge_191',['merge',['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategy.html#a161d214c83db7e0dc0812dabed6674fb',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentationStrategy::merge()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4d6a44991e6e9a4f1d74236e7d6fc012',1,'list< __inp, __rebind_inp >::merge(list &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a44306154a6f093d8168eff45b90aa3ad',1,'list< __inp, __rebind_inp >::merge(list &&__x, _StrictWeakOrdering __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a4794e46af448c443019e9b36640744ab',1,'std::forward_list::merge(forward_list &&__list)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a0de7b075b73cc0a843447ad75cba4b87',1,'std::forward_list::merge(forward_list &&__list, _Comp __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4d6a44991e6e9a4f1d74236e7d6fc012',1,'std::list::merge(list &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a44306154a6f093d8168eff45b90aa3ad',1,'std::list::merge(list &&__x, _StrictWeakOrdering __comp)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7d7b4d6c6ee504b30a20b1680029c7b4',1,'cv::merge(const Mat *mv, size_t count, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga61f2f2bde4a0a0154b2333ea504fab1d',1,'cv::merge(InputArrayOfArrays mv, OutputArray dst)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaac939dc3b178ee92fb6e7078f342622c',1,'cv::cuda::merge(const GpuMat *src, size_t n, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gafce19eb0fcad23f67ab45d544992436d',1,'cv::cuda::merge(const std::vector< GpuMat > &src, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7d7b4d6c6ee504b30a20b1680029c7b4',1,'merge(const Mat *mv, size_t count, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga61f2f2bde4a0a0154b2333ea504fab1d',1,'merge(InputArrayOfArrays mv, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaac939dc3b178ee92fb6e7078f342622c',1,'merge(const GpuMat *src, size_t n, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gafce19eb0fcad23f67ab45d544992436d',1,'merge(const std::vector< GpuMat > &src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabb18bc670a27e539246a2eb154f60351',1,'std::merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7f7771648d074e296d019153633efa8d',1,'std::merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabb18bc670a27e539246a2eb154f60351',1,'merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7f7771648d074e296d019153633efa8d',1,'merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)(Global Namespace)']]], - ['merge16u_192',['merge16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf3380647212f442cdc89ada0d26e5dd1',1,'cv::hal::merge16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf3380647212f442cdc89ada0d26e5dd1',1,'merge16u()(Global Namespace)']]], - ['merge3_193',['merge3',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaf63e894270a088695e6ec97d9a903971',1,'cv::gapi::merge3()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaf63e894270a088695e6ec97d9a903971',1,'merge3()(Global Namespace)']]], - ['merge32s_194',['merge32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6d608cfae074f0f75db7e7f4e760be0f',1,'cv::hal::merge32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6d608cfae074f0f75db7e7f4e760be0f',1,'merge32s()(Global Namespace)']]], - ['merge4_195',['merge4',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga8206d42b933edcbf08d6953e202d0dd0',1,'cv::gapi::merge4()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga8206d42b933edcbf08d6953e202d0dd0',1,'merge4()(Global Namespace)']]], - ['merge64s_196',['merge64s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5e717dd8d0a41c6c06793ab9308c8fc6',1,'cv::hal::merge64s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5e717dd8d0a41c6c06793ab9308c8fc6',1,'merge64s()(Global Namespace)']]], - ['merge8u_197',['merge8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6b834e84af204ef9becc0805dca5caab',1,'cv::hal::merge8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6b834e84af204ef9becc0805dca5caab',1,'merge8u()(Global Namespace)']]], - ['merge_5fpatch_198',['merge_patch',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a844a77cb154752d12118f10af26d54cb.html#a844a77cb154752d12118f10af26d54cb',1,'nlohmann::basic_json']]], - ['merged_199',['merged',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a59eb62d949598853fbc83836e8f2960c',1,'Eigen::AlignedBox']]], - ['mergesets_200',['mergeSets',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#ace5164c3b1500421c96c7b6cc4dfaa9d',1,'cv::detail::DisjointSets']]], - ['mersenne_5ftwister_5fengine_201',['mersenne_twister_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8987d5bb70c31ba8e4bb80f993acff85',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::mersenne_twister_engine()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8987d5bb70c31ba8e4bb80f993acff85',1,'std::mersenne_twister_engine::mersenne_twister_engine()']]], - ['messages_202',['messages',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a71483d79d47eaf8f3739c4b6b971b00e',1,'std::messages::messages(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a8cfe4d6b3be654727ca4f705c27b3d51',1,'std::messages::messages(__c_locale __cloc, const char *__s, size_t __refs=0)']]], - ['meta_203',['meta',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#acd5da358f7568c97824b029596f92b11',1,'cv::gapi::fluid::Buffer::meta()'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#a0b7410b59963f6fb33bdc2a45c518960',1,'cv::gapi::fluid::View::meta()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a351b4f65014f6c2b8b2832847d44bbd7.html#a351b4f65014f6c2b8b2832847d44bbd7',1,'nlohmann::basic_json::meta()']]], - ['metas_204',['metas',['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ae105107abedd589e94153a0e6f916367',1,'cv::GCompiled::metas()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#a027d4aa5e0fef550fe7389984482b3a5',1,'cv::GStreamingCompiled::metas()']]], - ['meterstogps_205',['metersToGPS',['../classGPSToMetersConverter.html#a434ba240ca25217c058cfa2b3f58b68d',1,'GPSToMetersConverter']]], - ['min_206',['min',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac22d7d32f1ec91fd106760a98a6f4731',1,'cv::MatExpr::min(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aafbfd6a44196ca5f40bcea5136548c22',1,'cv::MatExpr::min(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a865832a7380156566594f039d4ff0ff6',1,'cv::MatExpr::min(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6fdbec4b3fdb2b23f1d79bc73640d371',1,'cv::MatExpr::min(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a176d14d2ffed87f4e024d4933104a2bb',1,'cv::MatExpr::min(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac22d7d32f1ec91fd106760a98a6f4731',1,'cv::MatExpr::min(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aafbfd6a44196ca5f40bcea5136548c22',1,'cv::MatExpr::min(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a865832a7380156566594f039d4ff0ff6',1,'cv::MatExpr::min(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6fdbec4b3fdb2b23f1d79bc73640d371',1,'cv::MatExpr::min(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a176d14d2ffed87f4e024d4933104a2bb',1,'cv::MatExpr::min(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/da/d81/structcv_1_1cudev_1_1numeric__limits_3_01bool_01_4.html#a359fab492885fe351389d0f3b99e304a',1,'cv::cudev::numeric_limits< bool >::min()'],['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html#a079f77010993f609c5834184a3fc571e',1,'cv::cudev::numeric_limits< double >::min()'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html#aea8ce5e57cd0c36d0ca81a523e0640a1',1,'cv::cudev::numeric_limits< float >::min()'],['https://docs.opencv.org/4.2.0/da/d4e/structcv_1_1cudev_1_1numeric__limits_3_01schar_01_4.html#a22dd9ab6b9d4491a33a70c432e868187',1,'cv::cudev::numeric_limits< schar >::min()'],['https://docs.opencv.org/4.2.0/d1/d8b/structcv_1_1cudev_1_1numeric__limits_3_01short_01_4.html#a63563af1d24632a4b6d62cc168d54a06',1,'cv::cudev::numeric_limits< short >::min()'],['https://docs.opencv.org/4.2.0/d3/dc7/structcv_1_1cudev_1_1numeric__limits_3_01uchar_01_4.html#aac19eaa31ded65f911830b3f45e4e5ba',1,'cv::cudev::numeric_limits< uchar >::min()'],['https://docs.opencv.org/4.2.0/dd/d89/structcv_1_1cudev_1_1numeric__limits_3_01uint_01_4.html#ab9f226ae2e962a64a9ba9d89e1ecf288',1,'cv::cudev::numeric_limits< uint >::min()'],['https://docs.opencv.org/4.2.0/df/d47/structcv_1_1cudev_1_1numeric__limits_3_01ushort_01_4.html#a541b9509bbd6782ccf98bf2abc68380b',1,'cv::cudev::numeric_limits< ushort >::min()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9a426dcd6be0bd77995b636fe291e6d0',1,'cv::softdouble::min()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga2473116e9ce9a101a7e6ed53753df9b6',1,'cv::softfloat::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a7dc4b8a5f0edcf447683b93607a8441e',1,'gamma_distribution< double >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a7dc4b8a5f0edcf447683b93607a8441e',1,'gamma_distribution< result_type >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#aaf1720ef1664fa77a5972c78addfa290',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#aa79e79b65edcb6f45dda08b3efdff9e8',1,'normal_distribution< double >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#aa79e79b65edcb6f45dda08b3efdff9e8',1,'normal_distribution< result_type >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#acfd63c2f93e6215cd8304db6f5c39df4',1,'std::bernoulli_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a0dcaff746d5993e73b30cbbc70afbd05',1,'std::binomial_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#a93cbd65b4fa6d5a84149a0db63c7e10c',1,'std::cauchy_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a71039379ac60b7df94b625c4a45cb287',1,'std::chi_squared_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a16286565620fc6966ca53540572ede38',1,'std::discard_block_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a2ea8319bc859527d8a4f22380ab85672',1,'std::discrete_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a21226cd61a367799a695c438f6c0af26',1,'std::exponential_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#aa97af0bfaca27148976ef1a65ab257c5',1,'std::extreme_value_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a7b129ca3a6af6d6d063ecde317361ef8',1,'std::fisher_f_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a7dc4b8a5f0edcf447683b93607a8441e',1,'std::gamma_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#af711039331910d5b184bfcdb43e4e12b',1,'std::geometric_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a5900ce9b2214d848cce14cb82ce71397',1,'std::independent_bits_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a57c283a281f9b007e0a7659b57586f52',1,'std::linear_congruential_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#aa6d60ac02923738e93e5cc2813d9cfea',1,'std::lognormal_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#aaf1720ef1664fa77a5972c78addfa290',1,'std::mersenne_twister_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#ab4c3074bd3f87187e7de81a5ece8522c',1,'std::negative_binomial_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#aa79e79b65edcb6f45dda08b3efdff9e8',1,'std::normal_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#aae25581f91ebab83161d2da3fe0cdb9d',1,'std::numeric_limits::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a1d4e28300518616fef3f4b93a3d1d10d',1,'std::piecewise_constant_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#adaf7520277cc879942d011de156dc184',1,'std::piecewise_linear_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#afb49039795f3c63e256f6b4d2cfab433',1,'std::poisson_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a113fdc5d67d45435e869a9e905a3c658',1,'std::shuffle_order_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a40bd6b63baec90b927fc13bb5d3b2bba',1,'std::student_t_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a945725b8377db61951fc9c79a0f9aac1',1,'std::subtract_with_carry_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a6e74f2a2cb1d736ac814efd4691f7fe0',1,'std::uniform_int_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#a7e6fbfe7a4278ebf8a85cb9b4afa6ec2',1,'std::uniform_real_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41cf9f2fac24470499589628f657be67',1,'std::valarray::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a3060d7ec6a83eb719429f3a0677705ff',1,'std::weibull_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41cf9f2fac24470499589628f657be67',1,'valarray< size_t >::min()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#adad123f7e84a2437806a791b96af04bd',1,'Eigen::AlignedBox::min()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#af7fddcf06b60392f3f21b4d8e0f763a0',1,'Eigen::AlignedBox::min() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac48df53b8fd34b87e7b121fa8fd4c379',1,'cv::min(const softfloat &a, const softfloat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf625702f70e571f33784b0652be9a7b7',1,'cv::min(const softdouble &a, const softdouble &b)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9af368f182ee76d0463d0d8d5330b764',1,'cv::min(InputArray src1, InputArray src2, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0b8852cd1a92366860e390e8abbe78dc',1,'cv::min(const Mat &src1, const Mat &src2, Mat &dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa83bf3dce9a4a488675347fff6692cb9',1,'cv::min(const UMat &src1, const UMat &src2, UMat &dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga74f0b05a65b3d949c237abb5e6c60867',1,'cv::cuda::min()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166301154ec0c6fb8859c8126e013fac',1,'cv::cudev::min(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37cfadd8b02bc1989b2ff264d915a6b',1,'cv::cudev::min(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e7580e80893052d84dfb5ec5ca5f766',1,'cv::cudev::min(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99931470f4d68820bbc5459ed795da8d',1,'cv::cudev::min(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f515695538396fb8648b71901d058d',1,'cv::cudev::min(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad2901b8dd9a2efa1ea3a075ddf2d3f8',1,'cv::cudev::min(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga580140f65047fb3188cd74f2d0f69a08',1,'cv::cudev::min(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf199b5514de7c6a6af1b2c73c5725b7b',1,'cv::cudev::min(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa618ba2f3832b30d643cce7efa62a04c',1,'cv::cudev::min(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c687dbc301bada436f1b666ac1ad4de',1,'cv::cudev::min(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad638c54878b6ccf16f85915845369fb8',1,'cv::cudev::min(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77ec7dd3c8bf8d93adb1a0ae89226dc0',1,'cv::cudev::min(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68ba59a2fd07a335aa566788ae5b6dd8',1,'cv::cudev::min(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga570aa1a8375e90a96942ba5a9d73a8b9',1,'cv::cudev::min(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c5a8171954561ee7d86bad9a5b69ca',1,'cv::cudev::min(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d89f72aa99839fa446920cee353de8',1,'cv::cudev::min(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad897218ccbbb0e9cc8660213479afad2',1,'cv::cudev::min(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga211f9a750f17f04c671e1ecff782d3b0',1,'cv::cudev::min(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga534ff33d0fb6a9f231c45e11ec109c06',1,'cv::cudev::min(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76547c7e7ce1e38e4bfbc95c41f211a9',1,'cv::cudev::min(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f48115719f2492736e6c1e6e54b47bc',1,'cv::cudev::min(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea84f0591c4aa8110ee233fd83f3b2e7',1,'cv::cudev::min(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29bc62147e04bbc4d5cc713722b3ebc7',1,'cv::cudev::min(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a27832d49d358b841977db8ac614fe',1,'cv::cudev::min(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga874939daee476a502f9e25a60d11a0af',1,'cv::cudev::min(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17b5b845d773a38304e10c6f6ef7a63b',1,'cv::cudev::min(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40ba01d1818bae80a0b25cced8a91b0e',1,'cv::cudev::min(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ea00427d284684a5381f925c8865413',1,'cv::cudev::min(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e3b6cc4c9f631582962e2e8a570974',1,'cv::cudev::min(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cbeba62c9983bec445ede74fe15c5d',1,'cv::cudev::min(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a26ede9e7b8aff8af95843ae065a3d6',1,'cv::cudev::min(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3b5b82737560408526a05e60a01cf0c',1,'cv::cudev::min(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50b5e9c2bd4b51a9ca871a2affbab6be',1,'cv::cudev::min(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bc7c6f847a6b03438d75ad28b20e50',1,'cv::cudev::min(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5700161b6d3d48c4f6b6cb8f6893a77d',1,'cv::cudev::min(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7e88fd0b276bc8f582117afba6f69b8',1,'cv::cudev::min(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ebc299c55f1c956ba1bf59818339a9',1,'cv::cudev::min(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490a5a4ee4b491ca52355d3591963d36',1,'cv::cudev::min(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3deb31d4bd9746fe908aae0a32876a67',1,'cv::cudev::min(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7443e024eba9d6e7dba462db0f87b09',1,'cv::cudev::min(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f584667f590a24d7952bba2c38b9d38',1,'cv::cudev::min(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fa8e7016286ff7a654d7f61c0b229ed',1,'cv::cudev::min(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbdb0b1d874b4d611fbe2fc87aa6723e',1,'cv::cudev::min(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25355dc07c2a9bcfe29dd47ffbd1af1f',1,'cv::cudev::min(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga968ddc4b3f1330fd8bba47996a879279',1,'cv::cudev::min(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00c88b38b31430626b18a806bab64102',1,'cv::cudev::min(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01ef9f5f0c55a33ed31f61b8996a9ef2',1,'cv::cudev::min(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b6e96bf59d8775fe468c8b0f0cd4c59',1,'cv::cudev::min(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053670b49cc762f89cd71a48a23410b2',1,'cv::cudev::min(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ae5c5fe2a9037803d26dc7ac9dc84e6',1,'cv::cudev::min(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebde1cc8ab3c8a2489f018498b4af0e1',1,'cv::cudev::min(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga328aabd669c55a39527628ca404d6d68',1,'cv::cudev::min(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695465274932c09378b6c197485b592e',1,'cv::cudev::min(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga428a2859cdb238bbbbf2fdb9215514bc',1,'cv::cudev::min(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8c71d074f87253f2743bf2d51342f58',1,'cv::cudev::min(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad695d4aa08dad8457dc787eb5b973397',1,'cv::cudev::min(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0500af3d7867bfd51c3cad36ba0a491e',1,'cv::cudev::min(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40714aaf703568f042ac2334279c96be',1,'cv::cudev::min(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79fc45bfa8191d6dacaf6d791c8d657d',1,'cv::cudev::min(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf2fc475cfe7c1829fa659aad92f5311',1,'cv::cudev::min(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3311a28f02b9f7f2322042ba73793dc',1,'cv::cudev::min(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga578896b54a57ff07a3bf7d0c3fd2543f',1,'cv::cudev::min(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc186a6d010c07d69d9f2659f91f172',1,'cv::cudev::min(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c0b1bc40a2ec46f6eb78af0a80253e',1,'cv::cudev::min(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a838e528321de5c93cd881016818f4',1,'cv::cudev::min(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae91887a3df27695bfac7c04a17e7f317',1,'cv::cudev::min(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d81f05a2715d7b4869c831e948241f',1,'cv::cudev::min(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ffc1aaa7e1fbf701e7c705005bbddb',1,'cv::cudev::min(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1dccc25340fb0aaebd5570168f9523f',1,'cv::cudev::min(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6db34e52d79cc78bb82d6473ed9d260b',1,'cv::cudev::min(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d9172e56b98d1e9db062064c8871c2a',1,'cv::cudev::min(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43a5a174cfe82f50b81cae0fef539eb2',1,'cv::cudev::min(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a35bdd7cf565b9ade2b66e59bd0ed',1,'cv::cudev::min(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f2de1cd74a26036c9655cac8f4fd12b',1,'cv::cudev::min(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bbfbc5daa53d92b244b57ea9c7001b3',1,'cv::cudev::min(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c0105c80bfe524779da1b354f6757e6',1,'cv::cudev::min(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga376a6835981117634436f321b2ce2a92',1,'cv::cudev::min(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abd5ca68674510c6de74842959cfdc7',1,'cv::cudev::min(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb06294a2cfbb6069b757839c7fd9da',1,'cv::cudev::min(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ff980b4d39740767b63f1de88d1b57',1,'cv::cudev::min(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7df99230006a5cc5615b0011df7a36',1,'cv::cudev::min(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab249d89f99bb58dd18ca378c735a020',1,'cv::cudev::min(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0253aab8205cbcdfe6214ac2a69fe581',1,'cv::cudev::min(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520bff992e84829c710b2e09546fa22',1,'cv::cudev::min(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f2589513e2749a9851c4124646619b9',1,'cv::cudev::min(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5cbd2b6ca7192b0bd8e8495ef5159b8',1,'cv::cudev::min(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0488483f92053697cbcd087185945cf1',1,'cv::cudev::min(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01bddf9f2a64d5b3e53439be20d9c409',1,'cv::cudev::min(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfea1d9d44ed701c8e800349e04f23ee',1,'cv::cudev::min(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad80ae937fbf7a3dc21a6a6fa8180b099',1,'cv::cudev::min(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72e8042831b9697209fae75abf289835',1,'cv::cudev::min(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff909acfd57096f7c944766d1f65439',1,'cv::cudev::min(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga994dcac74e8ff3a0f53eec9f742c97da',1,'cv::cudev::min(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bf016e8bdbabc4af9fa4e017c17507e',1,'cv::cudev::min(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0e38244f6b1acb8682e3f85143bd492',1,'cv::cudev::min(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabba296ea279127cee978c2e3fb735522',1,'cv::cudev::min(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44e25ba04453413a2aefc32c98efd3d9',1,'cv::cudev::min(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga269a8ed52e0311c9346d987a756dc884',1,'cv::cudev::min(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3fda8022014b87c0102d0bbe0731809',1,'cv::cudev::min(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf44d7528016be23f9f4ef3a7da28bdac',1,'cv::cudev::min(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bcbc2bc3b592e71257b4ee668778787',1,'cv::cudev::min(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b2d8959b9f43f2bc2806dc0ec78a100',1,'cv::cudev::min(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f0ef4c14e25abea43ff8946afeafc8',1,'cv::cudev::min(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca8f4d79b4cc1dec4c909ecf5ccca6a6',1,'cv::cudev::min(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae92efcdaa0c6fab988a414451359851a',1,'cv::cudev::min(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24f7488a901b2674720f7a5126131e64',1,'cv::cudev::min(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11a1d2f321a3eeef5dc50189f5b2ae9e',1,'cv::cudev::min(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39261d4880c70eb9e3ef72458b4ac242',1,'cv::cudev::min(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9eb9db0ca15633cccfddb52a962b6f6f',1,'cv::cudev::min(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e93316cdeb4b820699835dc2c2451cd',1,'cv::cudev::min(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4a86c57c6faaa3c448c0f865a29b26',1,'cv::cudev::min(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3948d81d0bef9933acb0e62becdaebb1',1,'cv::cudev::min(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0eb3c2749a2fc4328bdf119d66c6bc4',1,'cv::cudev::min(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08f676bba98d6a2b2ff33bbb36c458ff',1,'cv::cudev::min(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70b3c38288b779b54682e86ad916fdac',1,'cv::cudev::min(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga165246f51a13bed7eab30ef17dcbc866',1,'cv::cudev::min(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51aaec59cc082c1de9ff5943f582b8a7',1,'cv::cudev::min(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad94786f5db09d1f9ee11cd46a3072e9d',1,'cv::cudev::min(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fbef402308aa4d0431e52e9e59043fc',1,'cv::cudev::min(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bd9efd0d4387ea02188f653b32660ca',1,'cv::cudev::min(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa933f0fd3d30808cb1b00cd3a39143b1',1,'cv::cudev::min(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d51422ef09b9121b7869ad2e5e5343d',1,'cv::cudev::min(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb37e86108df64988afff37c569bf1a',1,'cv::cudev::min(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd636d4ca9bfb329325255cf9471c0b',1,'cv::cudev::min(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4985add7084003b38bae25ce9b5eae2',1,'cv::cudev::min(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc007a2636b9d49e09c17caccca7b41e',1,'cv::cudev::min(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef22b25899d27ffa8f09721d1f5d8b01',1,'cv::cudev::min(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a8db4271fd8c29e4a9c986c8ffa2eb',1,'cv::cudev::min(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0adb3df57e4ce8523b76eb59fe026c1',1,'cv::cudev::min(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99455f76095aede9458911725660297',1,'cv::cudev::min(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06193d22fbddc873a3062371b1854d71',1,'cv::cudev::min(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39835721b56a82de6caea12b5ee0015f',1,'cv::cudev::min(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a9e0cefdaf6cb3661a2319e677167d1',1,'cv::cudev::min(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9376163743f15adf0f696ad00a5e96a2',1,'cv::cudev::min(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga684f17ba826938b730c28b1cf7e16970',1,'cv::cudev::min(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga245743829629cc8a53765790b8ef1433',1,'cv::cudev::min(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae70127cdf2e353258baef57e46ab4189',1,'cv::cudev::min(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf82c6bf26acf9096cd6f8d832e205a9e',1,'cv::cudev::min(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f990e7805334d097290763648fe0d15',1,'cv::cudev::min(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc89effe4a6e1877b214a90c228295fb',1,'cv::cudev::min(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac39cc5c8089033352304fecdb0c23a4a',1,'cv::cudev::min(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga609464e0f3eadb85eb02553bc55c966b',1,'cv::cudev::min(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d1edf16d076507bdeac3810ac34fea1',1,'cv::cudev::min(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6ff0c0ed6a04957c5ebfedd44429fa',1,'cv::cudev::min(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf850e4d7c3c2c5e301a444d81f97b0e9',1,'cv::cudev::min(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28fb416063c7287d74bd18444dbad517',1,'cv::cudev::min(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafac21d2fddb5266c56b94f0cd5060957',1,'cv::cudev::min(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafc4c9e25951034a070b138191a1646a',1,'cv::cudev::min(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a023347bfd7b017630d6396006c919e',1,'cv::cudev::min(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab395407fb935812dd1b2ebbba595861a',1,'cv::cudev::min(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8a6eebe9af1fab17cf91f2aeb54085b',1,'cv::cudev::min(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e644816e75c72b1f5514aa1c9a559f2',1,'cv::cudev::min(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9233bc7f6b5a39cf9b548d268c878a5e',1,'cv::cudev::min(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6b7c35282b6fc4f731ca3c1a7675ed',1,'cv::cudev::min(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e3044507d9d9f6ea035c12e342bf4c4',1,'cv::cudev::min(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga712cbf6a3192826a28b292961344ec8b',1,'cv::cudev::min(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa757af15c28d5ece108f75b9d31303e2',1,'cv::cudev::min(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07de7b9863eb6866b8551688ab0cee91',1,'cv::cudev::min(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1abaccc6127e9ae108f715ea8ca240f',1,'cv::cudev::min(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b09d9c14fe356cdc8fa9e3a11ed35f9',1,'cv::cudev::min(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f99b55e3715d2f70934264240b9ea1a',1,'cv::cudev::min(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd5d53908ea8d992b7176d4f70bf2e1',1,'cv::cudev::min(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad65bb9c77829a24470594a1a06957a1d',1,'cv::cudev::min(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeadc2b477ffa2ba5629c1eeca0b49d63',1,'cv::cudev::min(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41cae75d54fbbd09e25adb26e58458f3',1,'cv::cudev::min(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e5555ef897df48dc04fed27b35a519d',1,'cv::cudev::min(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63987f0c60443f7907a223a23429fa16',1,'cv::cudev::min(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaded7b15e951de4fec9096063ca51bf1b',1,'cv::cudev::min(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae55f0ba96bec14b409e1908032060a01',1,'cv::cudev::min(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71aea75a5c530a382493ca538b9b3018',1,'cv::cudev::min(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451f65567b74e7f92a5d0c1be7090e20',1,'cv::cudev::min(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga003b58a72697803ec951afece96b067c',1,'cv::cudev::min(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga533e7120fae1d8ebc4f464b5ad076ff2',1,'cv::cudev::min(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f8f3331bd8cdfd7d2d0146115910a6c',1,'cv::cudev::min(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b6dea62568edd9aa7cfc0b7ee379b2e',1,'cv::cudev::min(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a607b7403c4299e0c743e50d2f70a0f',1,'cv::cudev::min(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac96713804ac8f9c0be35643a2d6b38a0',1,'cv::cudev::min(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga706808dc4050b903da640de8dc4ce19c',1,'cv::cudev::min(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6d1a1c63011d0b7f43a55e5c867065',1,'cv::cudev::min(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaafdf291e5b12dd034c25a0700e380df',1,'cv::cudev::min(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac052d68d62664c6a829fcfc234b5ad2a',1,'cv::cudev::min(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76f6319d3c3b6aea1d9cfa7e08ec645b',1,'cv::cudev::min(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41aac042716daa83b5cdafd2896cb20e',1,'cv::cudev::min(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga505a34b8ad2b832c446adc4693575ec1',1,'cv::cudev::min(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd2121e8d2a8eb3c442170ce48b30b1',1,'cv::cudev::min(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42f5af056b00eca967153edcf7588cd',1,'cv::cudev::min(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eca6d43aa7825a5757bf5f7effa2c17',1,'cv::cudev::min(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b0dc3a4d4aa6124c3e507986d97dfa',1,'cv::cudev::min(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f1b5f9d9048faafff9fb2d71b48bc66',1,'cv::cudev::min(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74639cd57a08c6e6f002d67251dd6e9',1,'cv::cudev::min(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547a488ab3fd582ac967006d5d41f84b',1,'cv::cudev::min(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae52d65012143641cf97b730ecaf8b384',1,'cv::cudev::min(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5a7dace4270dd3ffb889566f1d4ca7',1,'cv::cudev::min(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bc085902b3894d4369dc5e90e5a7047',1,'cv::cudev::min(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd9203fd6fc69c27d18f0a6dab04cdde',1,'cv::cudev::min(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c6bbe4f5e2d46c15d0276414176ce5a',1,'cv::cudev::min(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e73fe37dc5804eb6fa06a2cb784d929',1,'cv::cudev::min(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d0256b15a322a01a295af1227b210d0',1,'cv::cudev::min(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ec000596d80b26bd3b935fc9f510579',1,'cv::cudev::min(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9b38519d19d3122a8a167758e380ed',1,'cv::cudev::min(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gab714c7a4adc847d75bfc080ac92924f4',1,'cv::gapi::min()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9af368f182ee76d0463d0d8d5330b764',1,'min(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0b8852cd1a92366860e390e8abbe78dc',1,'min(const Mat &src1, const Mat &src2, Mat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa83bf3dce9a4a488675347fff6692cb9',1,'min(const UMat &src1, const UMat &src2, UMat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga2473116e9ce9a101a7e6ed53753df9b6',1,'min()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac48df53b8fd34b87e7b121fa8fd4c379',1,'min(const softfloat &a, const softfloat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf625702f70e571f33784b0652be9a7b7',1,'min(const softdouble &a, const softdouble &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gab714c7a4adc847d75bfc080ac92924f4',1,'min(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga74f0b05a65b3d949c237abb5e6c60867',1,'min(InputArray src1, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166301154ec0c6fb8859c8126e013fac',1,'min(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37cfadd8b02bc1989b2ff264d915a6b',1,'min(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e7580e80893052d84dfb5ec5ca5f766',1,'min(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99931470f4d68820bbc5459ed795da8d',1,'min(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f515695538396fb8648b71901d058d',1,'min(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad2901b8dd9a2efa1ea3a075ddf2d3f8',1,'min(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga580140f65047fb3188cd74f2d0f69a08',1,'min(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf199b5514de7c6a6af1b2c73c5725b7b',1,'min(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa618ba2f3832b30d643cce7efa62a04c',1,'min(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c687dbc301bada436f1b666ac1ad4de',1,'min(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad638c54878b6ccf16f85915845369fb8',1,'min(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77ec7dd3c8bf8d93adb1a0ae89226dc0',1,'min(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68ba59a2fd07a335aa566788ae5b6dd8',1,'min(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga570aa1a8375e90a96942ba5a9d73a8b9',1,'min(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c5a8171954561ee7d86bad9a5b69ca',1,'min(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d89f72aa99839fa446920cee353de8',1,'min(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad897218ccbbb0e9cc8660213479afad2',1,'min(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga211f9a750f17f04c671e1ecff782d3b0',1,'min(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga534ff33d0fb6a9f231c45e11ec109c06',1,'min(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76547c7e7ce1e38e4bfbc95c41f211a9',1,'min(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f48115719f2492736e6c1e6e54b47bc',1,'min(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea84f0591c4aa8110ee233fd83f3b2e7',1,'min(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29bc62147e04bbc4d5cc713722b3ebc7',1,'min(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a27832d49d358b841977db8ac614fe',1,'min(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga874939daee476a502f9e25a60d11a0af',1,'min(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17b5b845d773a38304e10c6f6ef7a63b',1,'min(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40ba01d1818bae80a0b25cced8a91b0e',1,'min(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ea00427d284684a5381f925c8865413',1,'min(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e3b6cc4c9f631582962e2e8a570974',1,'min(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cbeba62c9983bec445ede74fe15c5d',1,'min(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a26ede9e7b8aff8af95843ae065a3d6',1,'min(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3b5b82737560408526a05e60a01cf0c',1,'min(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50b5e9c2bd4b51a9ca871a2affbab6be',1,'min(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bc7c6f847a6b03438d75ad28b20e50',1,'min(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5700161b6d3d48c4f6b6cb8f6893a77d',1,'min(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7e88fd0b276bc8f582117afba6f69b8',1,'min(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ebc299c55f1c956ba1bf59818339a9',1,'min(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490a5a4ee4b491ca52355d3591963d36',1,'min(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3deb31d4bd9746fe908aae0a32876a67',1,'min(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7443e024eba9d6e7dba462db0f87b09',1,'min(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f584667f590a24d7952bba2c38b9d38',1,'min(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fa8e7016286ff7a654d7f61c0b229ed',1,'min(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbdb0b1d874b4d611fbe2fc87aa6723e',1,'min(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25355dc07c2a9bcfe29dd47ffbd1af1f',1,'min(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga968ddc4b3f1330fd8bba47996a879279',1,'min(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00c88b38b31430626b18a806bab64102',1,'min(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01ef9f5f0c55a33ed31f61b8996a9ef2',1,'min(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b6e96bf59d8775fe468c8b0f0cd4c59',1,'min(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053670b49cc762f89cd71a48a23410b2',1,'min(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ae5c5fe2a9037803d26dc7ac9dc84e6',1,'min(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebde1cc8ab3c8a2489f018498b4af0e1',1,'min(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga328aabd669c55a39527628ca404d6d68',1,'min(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695465274932c09378b6c197485b592e',1,'min(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga428a2859cdb238bbbbf2fdb9215514bc',1,'min(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8c71d074f87253f2743bf2d51342f58',1,'min(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad695d4aa08dad8457dc787eb5b973397',1,'min(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0500af3d7867bfd51c3cad36ba0a491e',1,'min(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40714aaf703568f042ac2334279c96be',1,'min(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79fc45bfa8191d6dacaf6d791c8d657d',1,'min(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf2fc475cfe7c1829fa659aad92f5311',1,'min(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3311a28f02b9f7f2322042ba73793dc',1,'min(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga578896b54a57ff07a3bf7d0c3fd2543f',1,'min(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc186a6d010c07d69d9f2659f91f172',1,'min(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c0b1bc40a2ec46f6eb78af0a80253e',1,'min(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a838e528321de5c93cd881016818f4',1,'min(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae91887a3df27695bfac7c04a17e7f317',1,'min(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d81f05a2715d7b4869c831e948241f',1,'min(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ffc1aaa7e1fbf701e7c705005bbddb',1,'min(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1dccc25340fb0aaebd5570168f9523f',1,'min(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6db34e52d79cc78bb82d6473ed9d260b',1,'min(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d9172e56b98d1e9db062064c8871c2a',1,'min(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43a5a174cfe82f50b81cae0fef539eb2',1,'min(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a35bdd7cf565b9ade2b66e59bd0ed',1,'min(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f2de1cd74a26036c9655cac8f4fd12b',1,'min(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bbfbc5daa53d92b244b57ea9c7001b3',1,'min(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c0105c80bfe524779da1b354f6757e6',1,'min(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga376a6835981117634436f321b2ce2a92',1,'min(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abd5ca68674510c6de74842959cfdc7',1,'min(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb06294a2cfbb6069b757839c7fd9da',1,'min(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ff980b4d39740767b63f1de88d1b57',1,'min(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7df99230006a5cc5615b0011df7a36',1,'min(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab249d89f99bb58dd18ca378c735a020',1,'min(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0253aab8205cbcdfe6214ac2a69fe581',1,'min(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520bff992e84829c710b2e09546fa22',1,'min(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f2589513e2749a9851c4124646619b9',1,'min(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5cbd2b6ca7192b0bd8e8495ef5159b8',1,'min(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0488483f92053697cbcd087185945cf1',1,'min(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01bddf9f2a64d5b3e53439be20d9c409',1,'min(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfea1d9d44ed701c8e800349e04f23ee',1,'min(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad80ae937fbf7a3dc21a6a6fa8180b099',1,'min(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72e8042831b9697209fae75abf289835',1,'min(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff909acfd57096f7c944766d1f65439',1,'min(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga994dcac74e8ff3a0f53eec9f742c97da',1,'min(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bf016e8bdbabc4af9fa4e017c17507e',1,'min(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0e38244f6b1acb8682e3f85143bd492',1,'min(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabba296ea279127cee978c2e3fb735522',1,'min(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44e25ba04453413a2aefc32c98efd3d9',1,'min(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga269a8ed52e0311c9346d987a756dc884',1,'min(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3fda8022014b87c0102d0bbe0731809',1,'min(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf44d7528016be23f9f4ef3a7da28bdac',1,'min(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bcbc2bc3b592e71257b4ee668778787',1,'min(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b2d8959b9f43f2bc2806dc0ec78a100',1,'min(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f0ef4c14e25abea43ff8946afeafc8',1,'min(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca8f4d79b4cc1dec4c909ecf5ccca6a6',1,'min(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae92efcdaa0c6fab988a414451359851a',1,'min(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24f7488a901b2674720f7a5126131e64',1,'min(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11a1d2f321a3eeef5dc50189f5b2ae9e',1,'min(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39261d4880c70eb9e3ef72458b4ac242',1,'min(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9eb9db0ca15633cccfddb52a962b6f6f',1,'min(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e93316cdeb4b820699835dc2c2451cd',1,'min(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4a86c57c6faaa3c448c0f865a29b26',1,'min(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3948d81d0bef9933acb0e62becdaebb1',1,'min(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0eb3c2749a2fc4328bdf119d66c6bc4',1,'min(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08f676bba98d6a2b2ff33bbb36c458ff',1,'min(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70b3c38288b779b54682e86ad916fdac',1,'min(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga165246f51a13bed7eab30ef17dcbc866',1,'min(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51aaec59cc082c1de9ff5943f582b8a7',1,'min(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad94786f5db09d1f9ee11cd46a3072e9d',1,'min(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fbef402308aa4d0431e52e9e59043fc',1,'min(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bd9efd0d4387ea02188f653b32660ca',1,'min(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa933f0fd3d30808cb1b00cd3a39143b1',1,'min(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d51422ef09b9121b7869ad2e5e5343d',1,'min(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb37e86108df64988afff37c569bf1a',1,'min(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd636d4ca9bfb329325255cf9471c0b',1,'min(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4985add7084003b38bae25ce9b5eae2',1,'min(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc007a2636b9d49e09c17caccca7b41e',1,'min(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef22b25899d27ffa8f09721d1f5d8b01',1,'min(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a8db4271fd8c29e4a9c986c8ffa2eb',1,'min(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0adb3df57e4ce8523b76eb59fe026c1',1,'min(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99455f76095aede9458911725660297',1,'min(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06193d22fbddc873a3062371b1854d71',1,'min(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39835721b56a82de6caea12b5ee0015f',1,'min(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a9e0cefdaf6cb3661a2319e677167d1',1,'min(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9376163743f15adf0f696ad00a5e96a2',1,'min(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga684f17ba826938b730c28b1cf7e16970',1,'min(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga245743829629cc8a53765790b8ef1433',1,'min(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae70127cdf2e353258baef57e46ab4189',1,'min(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf82c6bf26acf9096cd6f8d832e205a9e',1,'min(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f990e7805334d097290763648fe0d15',1,'min(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc89effe4a6e1877b214a90c228295fb',1,'min(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac39cc5c8089033352304fecdb0c23a4a',1,'min(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga609464e0f3eadb85eb02553bc55c966b',1,'min(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d1edf16d076507bdeac3810ac34fea1',1,'min(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6ff0c0ed6a04957c5ebfedd44429fa',1,'min(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf850e4d7c3c2c5e301a444d81f97b0e9',1,'min(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28fb416063c7287d74bd18444dbad517',1,'min(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafac21d2fddb5266c56b94f0cd5060957',1,'min(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafc4c9e25951034a070b138191a1646a',1,'min(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a023347bfd7b017630d6396006c919e',1,'min(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab395407fb935812dd1b2ebbba595861a',1,'min(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8a6eebe9af1fab17cf91f2aeb54085b',1,'min(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e644816e75c72b1f5514aa1c9a559f2',1,'min(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9233bc7f6b5a39cf9b548d268c878a5e',1,'min(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6b7c35282b6fc4f731ca3c1a7675ed',1,'min(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e3044507d9d9f6ea035c12e342bf4c4',1,'min(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga712cbf6a3192826a28b292961344ec8b',1,'min(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa757af15c28d5ece108f75b9d31303e2',1,'min(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07de7b9863eb6866b8551688ab0cee91',1,'min(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1abaccc6127e9ae108f715ea8ca240f',1,'min(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b09d9c14fe356cdc8fa9e3a11ed35f9',1,'min(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f99b55e3715d2f70934264240b9ea1a',1,'min(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd5d53908ea8d992b7176d4f70bf2e1',1,'min(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad65bb9c77829a24470594a1a06957a1d',1,'min(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeadc2b477ffa2ba5629c1eeca0b49d63',1,'min(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41cae75d54fbbd09e25adb26e58458f3',1,'min(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e5555ef897df48dc04fed27b35a519d',1,'min(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63987f0c60443f7907a223a23429fa16',1,'min(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaded7b15e951de4fec9096063ca51bf1b',1,'min(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae55f0ba96bec14b409e1908032060a01',1,'min(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71aea75a5c530a382493ca538b9b3018',1,'min(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451f65567b74e7f92a5d0c1be7090e20',1,'min(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga003b58a72697803ec951afece96b067c',1,'min(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga533e7120fae1d8ebc4f464b5ad076ff2',1,'min(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f8f3331bd8cdfd7d2d0146115910a6c',1,'min(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b6dea62568edd9aa7cfc0b7ee379b2e',1,'min(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a607b7403c4299e0c743e50d2f70a0f',1,'min(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac96713804ac8f9c0be35643a2d6b38a0',1,'min(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga706808dc4050b903da640de8dc4ce19c',1,'min(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6d1a1c63011d0b7f43a55e5c867065',1,'min(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaafdf291e5b12dd034c25a0700e380df',1,'min(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac052d68d62664c6a829fcfc234b5ad2a',1,'min(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76f6319d3c3b6aea1d9cfa7e08ec645b',1,'min(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41aac042716daa83b5cdafd2896cb20e',1,'min(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga505a34b8ad2b832c446adc4693575ec1',1,'min(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd2121e8d2a8eb3c442170ce48b30b1',1,'min(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42f5af056b00eca967153edcf7588cd',1,'min(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eca6d43aa7825a5757bf5f7effa2c17',1,'min(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b0dc3a4d4aa6124c3e507986d97dfa',1,'min(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f1b5f9d9048faafff9fb2d71b48bc66',1,'min(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74639cd57a08c6e6f002d67251dd6e9',1,'min(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547a488ab3fd582ac967006d5d41f84b',1,'min(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae52d65012143641cf97b730ecaf8b384',1,'min(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5a7dace4270dd3ffb889566f1d4ca7',1,'min(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bc085902b3894d4369dc5e90e5a7047',1,'min(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd9203fd6fc69c27d18f0a6dab04cdde',1,'min(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c6bbe4f5e2d46c15d0276414176ce5a',1,'min(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e73fe37dc5804eb6fa06a2cb784d929',1,'min(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d0256b15a322a01a295af1227b210d0',1,'min(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ec000596d80b26bd3b935fc9f510579',1,'min(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9b38519d19d3122a8a167758e380ed',1,'min(const double3 &a, double s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a694c714713cacc857e126157b5472448',1,'__gnu_parallel::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gad48656de2f272a953455e1fff2532125',1,'std::min(const _Tp &__a, const _Tp &__b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6499dc0f7db12560643a3b79db5357f6',1,'std::min(const _Tp &__a, const _Tp &__b, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41cf9f2fac24470499589628f657be67',1,'min() const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gad48656de2f272a953455e1fff2532125',1,'min(const _Tp &__a, const _Tp &__b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6499dc0f7db12560643a3b79db5357f6',1,'min(const _Tp &__a, const _Tp &__b, _Compare __comp)(Global Namespace)']]], - ['min16s_207',['min16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae83e8c8c49856c8ff27464a5db0d9675',1,'cv::hal::min16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae83e8c8c49856c8ff27464a5db0d9675',1,'min16s()(Global Namespace)']]], - ['min16u_208',['min16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga335e895c38ac1eb36c369be486da8153',1,'cv::hal::min16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga335e895c38ac1eb36c369be486da8153',1,'min16u()(Global Namespace)']]], - ['min32f_209',['min32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf5f3e8331a257006805cc99669177886',1,'cv::hal::min32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf5f3e8331a257006805cc99669177886',1,'min32f()(Global Namespace)']]], - ['min32s_210',['min32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5700a944987bea8f8b1d690bef9ddb86',1,'cv::hal::min32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5700a944987bea8f8b1d690bef9ddb86',1,'min32s()(Global Namespace)']]], - ['min64f_211',['min64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1dfb30bfd99e7ec82e403ac1d2ba564',1,'cv::hal::min64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1dfb30bfd99e7ec82e403ac1d2ba564',1,'min64f()(Global Namespace)']]], - ['min8s_212',['min8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga776e806b44d419b8fe1aeeb0edc33b19',1,'cv::hal::min8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga776e806b44d419b8fe1aeeb0edc33b19',1,'min8s()(Global Namespace)']]], - ['min8u_213',['min8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga728aef20afc83e88001bf555e5375820',1,'cv::hal::min8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga728aef20afc83e88001bf555e5375820',1,'min8u()(Global Namespace)']]], - ['min_5f_214',['min_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03ebd56c9351013f5bb957a585f7137',1,'cv::cudev::min_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03ebd56c9351013f5bb957a585f7137',1,'min_()(Global Namespace)']]], - ['min_5felement_215',['min_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga1de5df2bd9b3d6e5716e82c95ae6df2a',1,'std::min_element(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaef494344047573854d8e2d34070fd2b4',1,'std::min_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga1de5df2bd9b3d6e5716e82c95ae6df2a',1,'min_element(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaef494344047573854d8e2d34070fd2b4',1,'min_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], - ['minarearect_216',['minAreaRect',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga3d476a3417130ae5154aea421ca7ead9',1,'cv::minAreaRect()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga3d476a3417130ae5154aea421ca7ead9',1,'minAreaRect()(Global Namespace)']]], - ['mincoeff_217',['minCoeff',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'Eigen::DenseBase::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'Eigen::DenseBase::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'Eigen::DenseBase::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'DenseBase< ArrayWrapper< ExpressionType > >::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'DenseBase< ArrayWrapper< ExpressionType > >::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'DenseBase< ArrayWrapper< ExpressionType > >::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'DenseBase< Solve< Decomposition, RhsType > >::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'DenseBase< Solve< Decomposition, RhsType > >::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'DenseBase< Solve< Decomposition, RhsType > >::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'Eigen::VectorwiseOp::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Derived, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Derived, Vertical >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::minCoeff()']]], - ['minenclosingcircle_218',['minEnclosingCircle',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8ce13c24081bbc7151e9326f412190f1',1,'cv::minEnclosingCircle()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8ce13c24081bbc7151e9326f412190f1',1,'minEnclosingCircle()(Global Namespace)']]], - ['minenclosingtriangle_219',['minEnclosingTriangle',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga1513e72f6bbdfc370563664f71e0542f',1,'cv::minEnclosingTriangle()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga1513e72f6bbdfc370563664f71e0542f',1,'minEnclosingTriangle()(Global Namespace)']]], - ['minimize_220',['minimize',['https://docs.opencv.org/4.2.0/df/d11/classcv_1_1MinProblemSolver.html#ade85ab8dceca1ee4974f62b758fa90af',1,'cv::MinProblemSolver']]], - ['mininlierratio_221',['minInlierRatio',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#a7601c6c793bbb8337f0de8526339c8af',1,'cv::videostab::MotionEstimatorRansacL2']]], - ['minmax_222',['minMax',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga8d7de68c10717cf25e787e3c20d2dfee',1,'cv::cuda::minMax()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga8d7de68c10717cf25e787e3c20d2dfee',1,'minMax()(Global Namespace)']]], - ['minmax_223',['minmax',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga67c7bf4c4b3c5cbf251a3812e06e0308',1,'std::minmax(const _Tp &__a, const _Tp &__b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga74c98df71fd53702699434040aacb249',1,'std::minmax(const _Tp &__a, const _Tp &__b, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga67c7bf4c4b3c5cbf251a3812e06e0308',1,'minmax(const _Tp &__a, const _Tp &__b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga74c98df71fd53702699434040aacb249',1,'minmax(const _Tp &__a, const _Tp &__b, _Compare __comp)(Global Namespace)']]], - ['minmax_5felement_224',['minmax_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabaec6cf28af83896d2253693d08d4cfe',1,'std::minmax_element(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaa8e6bf20463e0f605a548e7d7efb099d',1,'std::minmax_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabaec6cf28af83896d2253693d08d4cfe',1,'minmax_element(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaa8e6bf20463e0f605a548e7d7efb099d',1,'minmax_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], - ['minmaxidx_225',['minMaxIdx',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7622c466c628a75d9ed008b42250a73f',1,'cv::minMaxIdx()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7622c466c628a75d9ed008b42250a73f',1,'minMaxIdx()(Global Namespace)']]], - ['minmaxloc_226',['minMaxLoc',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab473bf2eb6d14ff97e89b355dac20707',1,'cv::minMaxLoc(InputArray src, double *minVal, double *maxVal=0, Point *minLoc=0, Point *maxLoc=0, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8873b86a29c5af51cafdcee82f8150a7',1,'cv::minMaxLoc(const SparseMat &a, double *minVal, double *maxVal, int *minIdx=0, int *maxIdx=0)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga5cacbc2a2323c4eaa81e7390c5d9f530',1,'cv::cuda::minMaxLoc()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab473bf2eb6d14ff97e89b355dac20707',1,'minMaxLoc(InputArray src, double *minVal, double *maxVal=0, Point *minLoc=0, Point *maxLoc=0, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8873b86a29c5af51cafdcee82f8150a7',1,'minMaxLoc(const SparseMat &a, double *minVal, double *maxVal, int *minIdx=0, int *maxIdx=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga5cacbc2a2323c4eaa81e7390c5d9f530',1,'minMaxLoc(InputArray src, double *minVal, double *maxVal, Point *minLoc, Point *maxLoc, InputArray mask=noArray())(Global Namespace)']]], - ['minmaxval_5f_227',['minMaxVal_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf18a35345e39d8e38a32d6396e30a8e',1,'cv::cudev::minMaxVal_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf18a35345e39d8e38a32d6396e30a8e',1,'minMaxVal_()(Global Namespace)']]], - ['minorversion_228',['minorVersion',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a2dfd3373e10731b54083ebd415009679',1,'cv::cuda::DeviceInfo']]], - ['minval_5f_229',['minVal_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba7fa397fed60ac4af5595a4dce4d92a',1,'cv::cudev::minVal_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba7fa397fed60ac4af5595a4dce4d92a',1,'minVal_()(Global Namespace)']]], - ['mismatch_230',['mismatch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga44ee120346d18fb398be3891eb4a8c0c',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad3cb7460f4803c1073882c89456bb75c',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga67d3e43b97d25f32dd1661a93aa85ff1',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga07f5690e64fb9ece316f84ec99c28e5d',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga44ee120346d18fb398be3891eb4a8c0c',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad3cb7460f4803c1073882c89456bb75c',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _BinaryPredicate __binary_pred)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga67d3e43b97d25f32dd1661a93aa85ff1',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga07f5690e64fb9ece316f84ec99c28e5d',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _BinaryPredicate __binary_pred)(Global Namespace)']]], - ['missingvalue_231',['missingValue',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#a852e02da238303d33fd5923b75657584',1,'cv::ml::TrainData']]], - ['mixchannels_232',['mixChannels',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga51d768c270a1cdd3497255017c4504be',1,'cv::mixChannels(const Mat *src, size_t nsrcs, Mat *dst, size_t ndsts, const int *fromTo, size_t npairs)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga89dd05fd8fe54f5b7b5d89bca21153a1',1,'cv::mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const int *fromTo, size_t npairs)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga83b61f9875e6618ee08487b21ec71ab1',1,'cv::mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const std::vector< int > &fromTo)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga51d768c270a1cdd3497255017c4504be',1,'mixChannels(const Mat *src, size_t nsrcs, Mat *dst, size_t ndsts, const int *fromTo, size_t npairs)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga89dd05fd8fe54f5b7b5d89bca21153a1',1,'mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const int *fromTo, size_t npairs)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga83b61f9875e6618ee08487b21ec71ab1',1,'mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const std::vector< int > &fromTo)(Global Namespace)']]], - ['mkview_233',['mkView',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a6f0fc00343ffd3e22573d85864785f39',1,'cv::gapi::fluid::Buffer']]], - ['mlab_234',['mlab',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1aa89085077df1acc691a2f02f39cefd',1,'cv::viz::Color']]], - ['model_235',['Model',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a5ccfd862a641a6b48472a88d821f33bf',1,'cv::dnn::Model::Model()'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a7ad13e315a170b9c5e3ca212a1a0a909',1,'cv::dnn::Model::Model(const String &model, const String &config="")'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#aeda26984960f2985f0071e33a51b34d3',1,'cv::dnn::Model::Model(const Net &network)']]], - ['modelestimation_236',['modelEstimation',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a84d712f280d1c4d0a8311f8f53089a2e',1,'cv::TrackerModel']]], - ['modelestimationimpl_237',['modelEstimationImpl',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#ad528142f5c5a1d2a7e122f54384a63ae',1,'cv::TrackerModel']]], - ['modelupdate_238',['modelUpdate',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a5049f30348c44b6aebb3651f3767dab0',1,'cv::TrackerModel']]], - ['modelupdateimpl_239',['modelUpdateImpl',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a6e17cc80adc68abf0c172be19b4bdc8a',1,'cv::TrackerModel']]], - ['modifiedcensustransform_240',['modifiedCensusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a27aeb319591612c6833327da2708277c',1,'cv::stereo::modifiedCensusTransform(const cv::Mat &img1, const cv::Mat &img2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2, const int type, int t=0, const cv::Mat &IntegralImage1=cv::Mat::zeros(100, 100, CV_8UC1), const cv::Mat &IntegralImage2=cv::Mat::zeros(100, 100, CV_8UC1))'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#af330a2a2f52998367d0c845f62d022a6',1,'cv::stereo::modifiedCensusTransform(const cv::Mat &img1, int kernelSize, cv::Mat &dist, const int type, int t=0, const cv::Mat &IntegralImage=cv::Mat::zeros(100, 100, CV_8UC1))']]], - ['modifiedcscensus_241',['ModifiedCsCensus',['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#a2d69cd7875e886e398ebabe4dab2b7e3',1,'cv::stereo::ModifiedCsCensus::ModifiedCsCensus()'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#aedb39a47b4821dd3deb2cc334daeabcd',1,'cv::stereo::ModifiedCsCensus::ModifiedCsCensus(uint8_t **images, int ker)']]], - ['moments_242',['Moments',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a0382b98fdb23acdcb05c91a2a44e5a1f',1,'cv::Moments::Moments()'],['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ab8972f76cccd51af351cbda199fb4a0d',1,'cv::Moments::Moments(double m00, double m10, double m01, double m20, double m11, double m02, double m30, double m21, double m12, double m03)']]], - ['moments_243',['moments',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga556a180f43cab22649c23ada36a8a139',1,'cv::moments()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga556a180f43cab22649c23ada36a8a139',1,'moments()(Global Namespace)']]], - ['money_5fget_244',['money_get',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a56b27ade4915b3ac1ae0e358f5f6266e',1,'std::money_get']]], - ['money_5fput_245',['money_put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a69471496da9b95b41529a08b14c063f5',1,'std::money_put']]], - ['moneypunct_246',['moneypunct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a82d4bbb3eaae4c5cf74e3652be13e67e',1,'std::moneypunct::moneypunct(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#aaabd1d7f1c7014add2c854305c76e73a',1,'std::moneypunct::moneypunct(__cache_type *__cache, size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a26aa970ef261e45586f3b161d2ec28e7',1,'std::moneypunct::moneypunct(__c_locale __cloc, const char *__s, size_t __refs=0)']]], - ['moreaccuratemotionwobblesuppressorbase_247',['MoreAccurateMotionWobbleSuppressorBase',['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html#a5c92896a72d9f706bca04fae077f614f',1,'cv::videostab::MoreAccurateMotionWobbleSuppressorBase']]], - ['morph_248',['morph',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga24d63a25f503c51da1d80c5d86cc27bd',1,'cv::hal::morph()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga24d63a25f503c51da1d80c5d86cc27bd',1,'morph()(Global Namespace)']]], - ['morphologydefaultbordervalue_249',['morphologyDefaultBorderValue',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga94756fad83d9d24d29c9bf478558c40a',1,'cv::morphologyDefaultBorderValue()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga94756fad83d9d24d29c9bf478558c40a',1,'morphologyDefaultBorderValue()(Global Namespace)']]], - ['morphologyex_250',['morphologyEx',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga67493776e3ad1a3df63883829375201f',1,'cv::morphologyEx()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga939a4d8afa86b012f6e3d006e6a32180',1,'cv::ximgproc::rl::morphologyEx()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga67493776e3ad1a3df63883829375201f',1,'morphologyEx(InputArray src, OutputArray dst, int op, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga939a4d8afa86b012f6e3d006e6a32180',1,'morphologyEx(InputArray rlSrc, OutputArray rlDest, int op, InputArray rlKernel, bool bBoundaryOnForErosion=true, Point anchor=Point(0, 0))(Global Namespace)']]], - ['mosaic_251',['Mosaic',['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html#ad655ea1c3d0eff93300e5cbcbbe434b6',1,'cv::gapi::wip::draw::Mosaic']]], - ['motionestimator_252',['motionEstimator',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a8ab5adc5cefe91ef4397bd2d01111b26',1,'cv::videostab::StabilizerBase::motionEstimator()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#ab4290a6b6ae538ca60c644cb7cf34038',1,'cv::videostab::WobbleSuppressorBase::motionEstimator()']]], - ['motionestimatorbase_253',['MotionEstimatorBase',['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html#ab1bc0253fe2d279148445e0e2f42c508',1,'cv::videostab::MotionEstimatorBase']]], - ['motionestimatorl1_254',['MotionEstimatorL1',['https://docs.opencv.org/4.2.0/d7/d29/classcv_1_1videostab_1_1MotionEstimatorL1.html#adc5c868f661775fb37a31a51ab1ea0d7',1,'cv::videostab::MotionEstimatorL1']]], - ['motionestimatorransacl2_255',['MotionEstimatorRansacL2',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#ae7d9545b45bc537042cdc4251a8237ca',1,'cv::videostab::MotionEstimatorRansacL2']]], - ['motionfilter_256',['motionFilter',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#a3b34bc7dc9c291f603aacb971fe41ee5',1,'cv::videostab::OnePassStabilizer']]], - ['motionfromessential_257',['motionFromEssential',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaee634880c5f298096ab2fc514de87cbd',1,'cv::sfm::motionFromEssential()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaee634880c5f298096ab2fc514de87cbd',1,'motionFromEssential()(Global Namespace)']]], - ['motionfromessentialchoosesolution_258',['motionFromEssentialChooseSolution',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga6bd98cb968781abf62659eedc0d0481e',1,'cv::sfm::motionFromEssentialChooseSolution()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga6bd98cb968781abf62659eedc0d0481e',1,'motionFromEssentialChooseSolution()(Global Namespace)']]], - ['motioninpainter_259',['MotionInpainter',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#aebf592dca89ac5e3f3cf94180b1fcad4',1,'cv::videostab::MotionInpainter']]], - ['motionmodel_260',['motionModel',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html#a841d954ea87bc9453590180096b36646',1,'cv::videostab::ImageMotionEstimatorBase::motionModel()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a0ad21d4676d5e0d07766f124f90b1a7e',1,'cv::videostab::InpainterBase::motionModel()'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#aef396847ece742047bcf40a415ffa898',1,'cv::videostab::KeypointBasedMotionEstimator::motionModel()'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a29e99ca5a23db566de09744a291363c5',1,'cv::videostab::LpMotionStabilizer::motionModel()'],['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html#a7a848cee402585520565e8346221af68',1,'cv::videostab::MotionEstimatorBase::motionModel()'],['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html#ac7c4c2596a7b18602ec444f4c3642409',1,'cv::videostab::ToFileMotionWriter::motionModel()']]], - ['motions_261',['motions',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a03c5fbf6b554fa16313e5966d4f650a9',1,'cv::videostab::DeblurerBase::motions()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#acd8158287f603009374c282ce20ccc95',1,'cv::videostab::InpainterBase::motions()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a4f646cec10ba28feddd082134edf2a60',1,'cv::videostab::WobbleSuppressorBase::motions() const']]], - ['motions2_262',['motions2',['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#ad60cdff01ba2c03f41000bcfa422b97b',1,'cv::videostab::WobbleSuppressorBase']]], - ['motionsaliencybinwangapr2014_263',['MotionSaliencyBinWangApr2014',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a48791bfcad75fa0572683f23a2fbb3c8',1,'cv::saliency::MotionSaliencyBinWangApr2014']]], - ['motionstabilizer_264',['motionStabilizer',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a7d5d9714f66ed34381f21f9e416a3c75',1,'cv::videostab::TwoPassStabilizer']]], - ['mouseevent_265',['MouseEvent',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a2566c9701613232f23ba6d9bae559853',1,'cv::viz::MouseEvent']]], - ['mov_266',['mov',['https://docs.opencv.org/4.2.0/df/d63/classcv_1_1detail_1_1BasicVectorRef.html#aa176aefc4d3a43adba8fda62632e1f1c',1,'cv::detail::BasicVectorRef::mov()'],['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html#a51c97bca58c3b1894fa588e45dcdf370',1,'cv::detail::VectorRef::mov()'],['https://docs.opencv.org/4.2.0/d2/dab/classcv_1_1detail_1_1VectorRefT.html#a91343bb7c3b8bd2960721ef84d778dcc',1,'cv::detail::VectorRefT::mov()']]], - ['move_267',['move',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ab6a8109eb6c9bb2e04fe32247d32eb59',1,'cv::_OutputArray::move(UMat &u) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ab185427c5ad1b0a5c75a0eae05171663',1,'cv::_OutputArray::move(Mat &m) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9f81219bfbfaac50d44f79095a639620',1,'std::move(_Tp &&__t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaedffc88b77674cbf9966e30a9c275bb6',1,'std::move(_II __first, _II __last, _OI __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaedffc88b77674cbf9966e30a9c275bb6',1,'move(_II __first, _II __last, _OI __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9f81219bfbfaac50d44f79095a639620',1,'move(_Tp &&__t) noexcept(Global Namespace)']]], - ['move_5fbackward_268',['move_backward',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga1743475fe627f5302b98ae41f8bf0ad5',1,'std::move_backward()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga1743475fe627f5302b98ae41f8bf0ad5',1,'move_backward()(Global Namespace)']]], - ['move_5fif_5fnoexcept_269',['move_if_noexcept',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gad065507b1d170a56e1ee2c77251554a3',1,'std::move_if_noexcept()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gad065507b1d170a56e1ee2c77251554a3',1,'move_if_noexcept()(Global Namespace)']]], - ['movewindow_270',['moveWindow',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8d86b207f7211250dbe6e28f76307ffb',1,'cv::moveWindow()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8d86b207f7211250dbe6e28f76307ffb',1,'moveWindow()(Global Namespace)']]], - ['mserstoerstats_271',['MSERsToERStats',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gaa40b490a66fa21eb1d89163202f69c86',1,'cv::text::MSERsToERStats()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gaa40b490a66fa21eb1d89163202f69c86',1,'MSERsToERStats()(Global Namespace)']]], - ['mul_272',['mul',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a385c09827713dc3e6d713bfad8460706',1,'cv::Mat::mul()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0e80cbf0fa6ed1187294697ab2b674ca',1,'cv::MatExpr::mul(const MatExpr &e, double scale=1) const'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a3be890f1c079879bbd106050972f24ea',1,'cv::MatExpr::mul(const Mat &m, double scale=1) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'cv::Matx::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< _Tp, cn, 1 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 1, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 2, 2 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 2, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 3, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 3, 4 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 4, 4 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, cn, 1 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float, 2, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float, 3, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float, cn, 1 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float_type, 4, 4 >::mul()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a0ef9335f112158eed19fd91fac110414',1,'cv::Scalar_::mul()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a0ef9335f112158eed19fd91fac110414',1,'Scalar_< double >::mul()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#af50d8160ca05a304b30c1dd64ae20755',1,'cv::UMat::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'cv::Vec::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< _Tp, 4 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, 2 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, 3 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, 4 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, GPCPatchDescriptor::nFeatures >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, nFeatures >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< float, 2 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< float, 3 >::mul()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga42a8187b2bf350f90e4a31f93e929e51',1,'cv::gapi::mul()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga42a8187b2bf350f90e4a31f93e929e51',1,'mul()(Global Namespace)']]], - ['mul16s_273',['mul16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8fb6f980b109edb1e4e0107334693ac9',1,'cv::hal::mul16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8fb6f980b109edb1e4e0107334693ac9',1,'mul16s()(Global Namespace)']]], - ['mul16u_274',['mul16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga242229fc8cc1fe5f840c737fc8d27e77',1,'cv::hal::mul16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga242229fc8cc1fe5f840c737fc8d27e77',1,'mul16u()(Global Namespace)']]], - ['mul32f_275',['mul32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1a577a4621637502343531e62aba9e4',1,'cv::hal::mul32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1a577a4621637502343531e62aba9e4',1,'mul32f()(Global Namespace)']]], - ['mul32s_276',['mul32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga87426b5ce323eee5c97f92f082df8c5c',1,'cv::hal::mul32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga87426b5ce323eee5c97f92f082df8c5c',1,'mul32s()(Global Namespace)']]], - ['mul64f_277',['mul64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38bd2b62ad3fa7906495708f82d16718',1,'cv::hal::mul64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38bd2b62ad3fa7906495708f82d16718',1,'mul64f()(Global Namespace)']]], - ['mul8s_278',['mul8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacf694c2099ea3046ff44575570235fc4',1,'cv::hal::mul8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacf694c2099ea3046ff44575570235fc4',1,'mul8s()(Global Namespace)']]], - ['mul8u_279',['mul8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3dd47e9d72de2668e8a1ae6b5ec99b29',1,'cv::hal::mul8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3dd47e9d72de2668e8a1ae6b5ec99b29',1,'mul8u()(Global Namespace)']]], - ['muladd_280',['mulAdd',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafe33592336ab4182d98316e65a151ccd',1,'cv::mulAdd(const softfloat &a, const softfloat &b, const softfloat &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafd3f019e0be823233d1a74330e3b2849',1,'cv::mulAdd(const softdouble &a, const softdouble &b, const softdouble &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafe33592336ab4182d98316e65a151ccd',1,'mulAdd(const softfloat &a, const softfloat &b, const softfloat &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafd3f019e0be823233d1a74330e3b2849',1,'mulAdd(const softdouble &a, const softdouble &b, const softdouble &c)(Global Namespace)']]], - ['mulandscalespectrums_281',['mulAndScaleSpectrums',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga5704c25b8be4f19da812e6d98c8ee464',1,'cv::cuda::mulAndScaleSpectrums()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga5704c25b8be4f19da812e6d98c8ee464',1,'mulAndScaleSpectrums()(Global Namespace)']]], - ['mulc_282',['mulC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa924c8c082e0476e4d846843d5f8bed3',1,'cv::gapi::mulC(const GMat &src, double multiplier, int ddepth=-1)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga173028247b9426f6e744c18df02c10f1',1,'cv::gapi::mulC(const GMat &src, const GScalar &multiplier, int ddepth=-1)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga29ed07435c1ab0da02627303594a9b73',1,'cv::gapi::mulC(const GScalar &multiplier, const GMat &src, int ddepth=-1)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa924c8c082e0476e4d846843d5f8bed3',1,'mulC(const GMat &src, double multiplier, int ddepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga173028247b9426f6e744c18df02c10f1',1,'mulC(const GMat &src, const GScalar &multiplier, int ddepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga29ed07435c1ab0da02627303594a9b73',1,'mulC(const GScalar &multiplier, const GMat &src, int ddepth=-1)(Global Namespace)']]], - ['mulspectrums_283',['mulSpectrums',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3ab38646463c59bf0ce962a9d51db64f',1,'cv::mulSpectrums()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#gab3e8900d67c4f59bdc137a0495206cd8',1,'cv::cuda::mulSpectrums()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3ab38646463c59bf0ce962a9d51db64f',1,'mulSpectrums(InputArray a, InputArray b, OutputArray c, int flags, bool conjB=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#gab3e8900d67c4f59bdc137a0495206cd8',1,'mulSpectrums(InputArray src1, InputArray src2, OutputArray dst, int flags, bool conjB=false, Stream &stream=Stream::Null())(Global Namespace)']]], - ['multibandblender_284',['MultiBandBlender',['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html#a22b424c9587d07da189cd1f15c664424',1,'cv::detail::MultiBandBlender']]], - ['multicameracalibration_285',['MultiCameraCalibration',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#a8fefc924b521891bfe9affebefd2ccbc',1,'cv::multicalib::MultiCameraCalibration']]], - ['multimap_286',['multimap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#acf3e6ab93785da86f181b584656de15d',1,'std::multimap::multimap()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1b00cb262efce13e4e5c323732c13109',1,'std::multimap::multimap(const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a75ee670e7ff1b74c62d3443ec05a9e4b',1,'std::multimap::multimap(const multimap &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#acbad3010aae4c8ce7ceb97ec5e2daff9',1,'std::multimap::multimap(multimap &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a64de4362141668b6b36fb6a399dbc9d4',1,'std::multimap::multimap(initializer_list< value_type > __l, const _Compare &__comp=_Compare(), const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a0ae31ea18b1274e6e6409795ae5286eb',1,'std::multimap::multimap(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a8105fc127e9fc15e90a050d7e0f7f11a',1,'std::multimap::multimap(const multimap &__m, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1093b678ea48aa26495ce2bbaf5dd4d7',1,'std::multimap::multimap(multimap &&__m, const allocator_type &__a) noexcept(is_nothrow_copy_constructible< _Compare >::value &&_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#aac222575af5d9600a5651357a978ecd6',1,'std::multimap::multimap(initializer_list< value_type > __l, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a4e1269440d1164dc556209ee07982358',1,'std::multimap::multimap(_InputIterator __first, _InputIterator __last, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ab2d27f68df308a944b432dbf91433e46',1,'std::multimap::multimap(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad11e806c3a5c1db4b888eac55459bbb3',1,'std::multimap::multimap(_InputIterator __first, _InputIterator __last, const _Compare &__comp, const allocator_type &__a=allocator_type())']]], - ['multiply_287',['multiply',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ac5a4ac08519b8229bfa99fba68f3bdc2',1,'cv::MatOp::multiply(const MatExpr &expr1, const MatExpr &expr2, MatExpr &res, double scale=1) const'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a5c992cafa34003955815dcaf95f5e745',1,'cv::MatOp::multiply(const MatExpr &expr1, double s, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga979d898a58d7f61c53003e162e7ad89f',1,'cv::multiply()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga497cc0615bf717e1e615143b56f00591',1,'cv::cuda::multiply()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga979d898a58d7f61c53003e162e7ad89f',1,'multiply(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga497cc0615bf717e1e615143b56f00591',1,'multiply(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1, Stream &stream=Stream::Null())(Global Namespace)']]], - ['multiprocessorcount_288',['multiProcessorCount',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8b4c6b2aed8ee5285bff0e42746fa363',1,'cv::cuda::DeviceInfo']]], - ['multiseq_5fpartition_289',['multiseq_partition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ade1f4c5da0794c4f1a09465d4aee6c1d',1,'__gnu_parallel']]], - ['multiseq_5fselection_290',['multiseq_selection',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a68f665a2f83172d9e12b8332ce573d5d',1,'__gnu_parallel']]], - ['multiset_291',['multiset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a694c6f511cd8cd15e116062bcaef1dc4',1,'std::multiset::multiset()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a38e27d171934c562e8f5fc48fba81564',1,'std::multiset::multiset(const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ac561d1612797aaf6022b371cce116035',1,'std::multiset::multiset(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae6acd6b5095c21d2a04c7d9afa6b02ab',1,'std::multiset::multiset(_InputIterator __first, _InputIterator __last, const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aeed9cc573fe8a3346634b3f28dda12a2',1,'std::multiset::multiset(const multiset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a851d2cffcf7183d7a16423d4964f8047',1,'std::multiset::multiset(multiset &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#adad316ede7ac22b3eff955eb6d9ab327',1,'std::multiset::multiset(initializer_list< value_type > __l, const _Compare &__comp=_Compare(), const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae8a1847b51c056d1abbc01fb76742632',1,'std::multiset::multiset(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a3ada945ca3237945e666bdc541accba1',1,'std::multiset::multiset(const multiset &__m, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a0bf2a4cf104ce19a863ac0438e1d3070',1,'std::multiset::multiset(multiset &&__m, const allocator_type &__a) noexcept(is_nothrow_copy_constructible< _Compare >::value &&_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a4bd596fbcfa91841dc0bfe442177c5ac',1,'std::multiset::multiset(initializer_list< value_type > __l, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a15b3f5d46a91d60ee98c0ac7f278476a',1,'std::multiset::multiset(_InputIterator __first, _InputIterator __last, const allocator_type &__a)']]], - ['multitracker_292',['MultiTracker',['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html#a919f18c31b860b5b20e372881b9f2265',1,'cv::MultiTracker']]], - ['multitracker_5falt_293',['MultiTracker_Alt',['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html#a24a9ebc9e0753576a13f8437e88b08e0',1,'cv::MultiTracker_Alt']]], - ['multiway_5fmerge_294',['multiway_merge',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a25294b0a47406aefa9ebc5e0c151d0ce',1,'__gnu_parallel']]], - ['multiway_5fmerge_5f3_5fvariant_295',['multiway_merge_3_variant',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a7ee9d79b73a6f85ae97e472312ba411e',1,'__gnu_parallel']]], - ['multiway_5fmerge_5f4_5fvariant_296',['multiway_merge_4_variant',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ac4af8f9977aa36823357bce35be6c946',1,'__gnu_parallel']]], - ['multiway_5fmerge_5fexact_5fsplitting_297',['multiway_merge_exact_splitting',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a567621588e461a8759651e29cd964ab9',1,'__gnu_parallel']]], - ['multiway_5fmerge_5floser_5ftree_298',['multiway_merge_loser_tree',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a150b06a4da2cf1cff673d1b6242c27fa',1,'__gnu_parallel']]], - ['multiway_5fmerge_5floser_5ftree_5fsentinel_299',['multiway_merge_loser_tree_sentinel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a686704fa4da0a4fdbc6800fe46048366',1,'__gnu_parallel']]], - ['multiway_5fmerge_5floser_5ftree_5funguarded_300',['multiway_merge_loser_tree_unguarded',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a3ffd0c9da50da6118291d38f95d44b52',1,'__gnu_parallel']]], - ['multiway_5fmerge_5fsampling_5fsplitting_301',['multiway_merge_sampling_splitting',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a0e39d3891745fd0e244fb125bf34ce8b',1,'__gnu_parallel']]], - ['multiway_5fmerge_5fsentinels_302',['multiway_merge_sentinels',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a4d6e76ac42b48f0033139352dcb0418f',1,'__gnu_parallel']]], - ['multransposed_303',['mulTransposed',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadc4e49f8f7a155044e3be1b9e3b270ab',1,'cv::mulTransposed()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadc4e49f8f7a155044e3be1b9e3b270ab',1,'mulTransposed()(Global Namespace)']]], - ['mustestimatetrimaratio_304',['mustEstimateTrimaRatio',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a39dbf002bfc87325c45726288c278b97',1,'cv::videostab::TwoPassStabilizer']]], - ['mvkernel_305',['MVKernel',['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#a9c14f938c0384395f268d3caa1211c41',1,'cv::stereo::MVKernel::MVKernel()'],['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#ad5be80bc8561c20b861bac19d54bf993',1,'cv::stereo::MVKernel::MVKernel(uint8_t **images, int **integral)']]] + ['matrixfunction_93',['matrixFunction',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1a6cc9f734eb175e785a1118305245fc',1,'Eigen::MatrixBase::matrixFunction()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1a6cc9f734eb175e785a1118305245fc',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::matrixFunction()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1a6cc9f734eb175e785a1118305245fc',1,'MatrixBase< Solve< Decomposition, RhsType > >::matrixFunction()']]], + ['matrixh_94',['matrixH',['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a8e781d2e22a2304647bcf0ae913cc8ea',1,'Eigen::HessenbergDecomposition::matrixH()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a8e781d2e22a2304647bcf0ae913cc8ea',1,'HessenbergDecomposition< MatrixType >::matrixH()']]], + ['matrixl_95',['matrixL',['https://eigen.tuxfamily.org/dox/classEigen_1_1IncompleteCholesky.html#a7d1f1878505fd1862e6f2286d27ff09a',1,'Eigen::IncompleteCholesky::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#af0e6a0df5679873b42cf82a372dd8ddb',1,'Eigen::LDLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a7f4a3eedbf82e7ce2d6bf0dcd84cdfa3',1,'Eigen::LLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#a80dfe1f4b4c8991252178de385e310bc',1,'Eigen::SimplicialLDLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a232f994f0106fa405c4066f7dbf81c95',1,'Eigen::SimplicialLLT::matrixL()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a35df62f4c1f7ed32f6ac39d94701b9a8',1,'Eigen::SparseLU::matrixL()']]], + ['matrixldlt_96',['matrixLDLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#aa5e0fd09dcd5251a8521fa248b95db0b',1,'Eigen::LDLT']]], + ['matrixllt_97',['matrixLLT',['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#af62881fc95c7e54a93b63c20f2c62b46',1,'Eigen::LLT']]], + ['matrixlu_98',['matrixLU',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#afea0b8fc707a9097d46fe358cb18bbff',1,'Eigen::FullPivLU::matrixLU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PartialPivLU.html#abea0d7e51c5591a6db152eade0892d9c',1,'Eigen::PartialPivLU::matrixLU()']]], + ['matrixq_99',['matrixQ',['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#ad26dd2d3c002939771d2375e4e051c28',1,'Eigen::FullPivHouseholderQR::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a346441e4902a58d43d698ac3da6ff791',1,'Eigen::HessenbergDecomposition::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HessenbergDecomposition.html#a346441e4902a58d43d698ac3da6ff791',1,'HessenbergDecomposition< MatrixType >::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a212bc2f69ea4eff830fde70e209e40fb',1,'Eigen::RealQZ::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a212bc2f69ea4eff830fde70e209e40fb',1,'RealQZ< MatrixType >::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#a348c5c00788b912c2bcb3e80be467877',1,'Eigen::SparseQR::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a4179a9d595d9bd58a649ef695b3db3c3',1,'Eigen::SPQR::matrixQ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a000f7392eda930576ffd2af1fae54af2',1,'Eigen::Tridiagonalization::matrixQ()']]], + ['matrixqr_100',['matrixQR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aa572ac050c8d4fadd4f08a87f6b1e62b',1,'Eigen::ColPivHouseholderQR::matrixQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aa572ac050c8d4fadd4f08a87f6b1e62b',1,'ColPivHouseholderQR< MatrixType >::matrixQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a9c16411e5d8f1fc634a5797018d5aa3e',1,'Eigen::FullPivHouseholderQR::matrixQR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderQR.html#ae837f2fb30099212c53b3042c7d699c9',1,'Eigen::HouseholderQR::matrixQR()']]], + ['matrixqtz_101',['matrixQTZ',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#ad89e2529fc1a8721239d9b6be9613a69',1,'Eigen::CompleteOrthogonalDecomposition']]], + ['matrixr_102',['matrixR',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a44c534d47bde6b67ce4b5247d142ef30',1,'Eigen::ColPivHouseholderQR::matrixR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#a44c534d47bde6b67ce4b5247d142ef30',1,'ColPivHouseholderQR< MatrixType >::matrixR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseQR.html#abe62644e0879b3e75836d63edf623899',1,'Eigen::SparseQR::matrixR()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SPQR.html#a99389f43e9eebe0b222e3b75318046e5',1,'Eigen::SPQR::matrixR()']]], + ['matrixs_103',['matrixS',['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ad24d7bf534afb55adaef00f00846adaf',1,'Eigen::RealQZ::matrixS()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#ad24d7bf534afb55adaef00f00846adaf',1,'RealQZ< MatrixType >::matrixS()']]], + ['matrixt_104',['matrixT',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a806213f5c96ff765265f47067229586d',1,'Eigen::CompleteOrthogonalDecomposition::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#add3ab5ed83f7f2f06b79fa910a2d5684',1,'Eigen::ComplexSchur::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#add3ab5ed83f7f2f06b79fa910a2d5684',1,'ComplexSchur< MatrixType >::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a8dc963d8ea2a17df9d8d718e9e34d06f',1,'Eigen::RealQZ::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a8dc963d8ea2a17df9d8d718e9e34d06f',1,'RealQZ< MatrixType >::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#abb78996b43b8642a5f507415730445cb',1,'Eigen::RealSchur::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#abb78996b43b8642a5f507415730445cb',1,'RealSchur< MatrixType >::matrixT()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Tridiagonalization.html#a6eb5ef94b8b9bb013c0e69b6df56d0df',1,'Eigen::Tridiagonalization::matrixT()']]], + ['matrixu_105',['matrixU',['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#afed8177cf9836f032d42bdb6c6bc6e01',1,'Eigen::ComplexSchur::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ComplexSchur.html#afed8177cf9836f032d42bdb6c6bc6e01',1,'ComplexSchur< MatrixType >::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LDLT.html#a54838a2e31e53bbe4dcb78b5e80c8484',1,'Eigen::LDLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1LLT.html#a18a390f085567e650e8345cc7e7c0df8',1,'Eigen::LLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a85622ccbecff99c8933d21f0a22b22bb',1,'Eigen::RealSchur::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealSchur.html#a85622ccbecff99c8933d21f0a22b22bb',1,'RealSchur< MatrixType >::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLDLT.html#ab486c0cd928c8b0c1c20c314f0963ad0',1,'Eigen::SimplicialLDLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SimplicialLLT.html#a173073880c5fc17661b4505259de4aa1',1,'Eigen::SimplicialLLT::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseLU.html#a5aa9a62f8d2c593a5817f4bc77c3e276',1,'Eigen::SparseLU::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#afc7fe1546b0f6e1801b86f22f5664cb8',1,'Eigen::SVDBase::matrixU()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#afc7fe1546b0f6e1801b86f22f5664cb8',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::matrixU()']]], + ['matrixv_106',['matrixV',['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a245a453b5e7347f737295c23133238c4',1,'Eigen::SVDBase::matrixV()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SVDBase.html#a245a453b5e7347f737295c23133238c4',1,'SVDBase< JacobiSVD< _MatrixType, QRPreconditioner > >::matrixV()']]], + ['matrixz_107',['matrixZ',['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a4cd178f13aefe5189d4beeb3eb1c5897',1,'Eigen::CompleteOrthogonalDecomposition::matrixZ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a19a116383f11423179b4d8f316da6f67',1,'Eigen::RealQZ::matrixZ()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RealQZ.html#a19a116383f11423179b4d8f316da6f67',1,'RealQZ< MatrixType >::matrixZ()']]], + ['matsize_108',['MatSize',['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a5e739605f00e00e40d5c0dca366c3fcd',1,'cv::MatSize']]], + ['matstep_109',['MatStep',['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a3ad7985df6dfb840590bb1442ed36e50',1,'cv::MatStep::MatStep()'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#ad38cde803142727c157a4b8050de2a16',1,'cv::MatStep::MatStep(size_t s)']]], + ['mattouiimage_110',['MatToUIImage',['https://docs.opencv.org/4.2.0/d2/d92/group__imgcodecs__ios.html#ga99a095c2334fd8bf933382f1cad12416',1,]]], + ['matx_111',['Matx',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'cv::Matx::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'cv::Matx::Matx(_Tp v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'cv::Matx::Matx(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'cv::Matx::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13, _Tp v14, _Tp v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'cv::Matx::Matx(const _Tp *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'cv::Matx::Matx(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'cv::Matx::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'cv::Matx::Matx(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'cv::Matx::Matx(const Matx< _Tp, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< _Tp, cn, 1 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< _Tp, cn, 1 >::Matx(_Tp v0, _Tp v1, _Tp v2, _Tp v3, _Tp v4, _Tp v5, _Tp v6, _Tp v7, _Tp v8, _Tp v9, _Tp v10, _Tp v11, _Tp v12, _Tp v13, _Tp v14, _Tp v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< _Tp, cn, 1 >::Matx(const _Tp *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< _Tp, cn, 1 >::Matx(std::initializer_list< _Tp >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< _Tp, cn, 1 >::Matx(const Matx< _Tp, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 1, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 1, 3 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 1, 3 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 1, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 1, 3 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 1, 3 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 1, 3 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 1, 3 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 2, 2 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 2, 2 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 2, 2 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 2, 2 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 2, 2 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 2, 2 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 2, 2 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 2, 2 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 2, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 2, 3 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 2, 3 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 2, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 2, 3 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 2, 3 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 2, 3 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 2, 3 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 3, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 3, 3 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 3, 3 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 3, 3 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 3, 3 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 3, 3 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 3, 3 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 3, 3 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 3, 4 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 3, 4 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 3, 4 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 3, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 3, 4 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 3, 4 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 3, 4 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 3, 4 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, 4, 4 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, 4, 4 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, 4, 4 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, 4, 4 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, 4, 4 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, 4, 4 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, 4, 4 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, 4, 4 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< double, cn, 1 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< double, cn, 1 >::Matx(double v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< double, cn, 1 >::Matx(double v0, double v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< double, cn, 1 >::Matx(double v0, double v1, double v2, double v3, double v4, double v5, double v6, double v7, double v8, double v9, double v10, double v11, double v12, double v13, double v14, double v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< double, cn, 1 >::Matx(const double *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< double, cn, 1 >::Matx(std::initializer_list< double >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, n > &a, const Matx< double, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< double, cn, 1 >::Matx(const Matx< double, m, l > &a, const Matx< double, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< double, cn, 1 >::Matx(const Matx< double, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float, 2, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float, 2, 3 >::Matx(float v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float, 2, 3 >::Matx(float v0, float v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float, 2, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13, float v14, float v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float, 2, 3 >::Matx(const float *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float, 2, 3 >::Matx(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float, 2, 3 >::Matx(const Matx< float, m, l > &a, const Matx< float, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float, 2, 3 >::Matx(const Matx< float, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float, 3, 3 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float, 3, 3 >::Matx(float v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float, 3, 3 >::Matx(float v0, float v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float, 3, 3 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13, float v14, float v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float, 3, 3 >::Matx(const float *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float, 3, 3 >::Matx(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float, 3, 3 >::Matx(const Matx< float, m, l > &a, const Matx< float, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float, 3, 3 >::Matx(const Matx< float, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float, cn, 1 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float, cn, 1 >::Matx(float v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float, cn, 1 >::Matx(float v0, float v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float, cn, 1 >::Matx(float v0, float v1, float v2, float v3, float v4, float v5, float v6, float v7, float v8, float v9, float v10, float v11, float v12, float v13, float v14, float v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float, cn, 1 >::Matx(const float *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float, cn, 1 >::Matx(std::initializer_list< float >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, n > &a, const Matx< float, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float, cn, 1 >::Matx(const Matx< float, m, l > &a, const Matx< float, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float, cn, 1 >::Matx(const Matx< float, n, m > &a, Matx_TOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a03e916d291e4922a0e96ea638b32066e',1,'Matx< float_type, 4, 4 >::Matx()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a72dba1f2b11abbd120989faeca002005',1,'Matx< float_type, 4, 4 >::Matx(float_type v0)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9b6773f6cd5b17bc4b4acaa450f17c0f',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a00cb206e86adfffa63b9d0474ded3f56',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a9ea79655491a8e300aa2946d32915510',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7156978618601cb86c3f45c8074976dc',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8fa16146cd3c5a9dc5ef684f8950576a',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d77fad0d4b799bbeb508708a0adc125',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#acd526d29f010fced07fac0f40910e9c8',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aece2123f4f5ee3b2feef5b2040f5a10b',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7db0ee3454c39f74096161652b4754cd',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a063f4e2a8351fcfade27f01834918f00',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9, float_type v10, float_type v11)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b928985c6849d798b9dda2da8206539',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9, float_type v10, float_type v11, float_type v12, float_type v13)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8d6414aaa86e104f325da7be04260a8b',1,'Matx< float_type, 4, 4 >::Matx(float_type v0, float_type v1, float_type v2, float_type v3, float_type v4, float_type v5, float_type v6, float_type v7, float_type v8, float_type v9, float_type v10, float_type v11, float_type v12, float_type v13, float_type v14, float_type v15)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abd7be06c6ddc6da806b56e7be192fb07',1,'Matx< float_type, 4, 4 >::Matx(const float_type *vals)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae747ae36b477e01422db61a3b3c47ead',1,'Matx< float_type, 4, 4 >::Matx(std::initializer_list< float_type >)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3f960898eebb4f9592486fc81840978f',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_AddOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adf035b49c0479f965a64831ffc610d75',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_SubOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab1293b20fb445c78451ec743a2bebabb',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, _T2 alpha, Matx_ScaleOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0b01f413b8f5db2dfee89fd449e5711d',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_MulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ae776dbc8f7256e7a644b71cd9d996c79',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b, Matx_DivOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a059fd9255b0922cddb4a14c6bf10390b',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, m, l > &a, const Matx< float_type, l, n > &b, Matx_MatMulOp)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#abf880ba8218784d49391802b69198810',1,'Matx< float_type, 4, 4 >::Matx(const Matx< float_type, n, m > &a, Matx_TOp)']]], + ['matxcommainitializer_112',['MatxCommaInitializer',['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#ad6172873d5585f6f43d6c116739c3046',1,'cv::MatxCommaInitializer::MatxCommaInitializer()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#ad6172873d5585f6f43d6c116739c3046',1,'MatxCommaInitializer< _Tp, m, 1 >::MatxCommaInitializer()']]], + ['max_113',['max',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6dff8b6e9105b6d817b493e7be157c90',1,'cv::MatExpr::max(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0326ec178e9d4ca09c54b6b488fb8021',1,'cv::MatExpr::max(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4a2fa0a37cba3f21b576ae4084757fba',1,'cv::MatExpr::max(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acb1ea96bb76c4014c399ef6ba536a7b0',1,'cv::MatExpr::max(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8ee69a65a23b73a176ab5ef9a6e5d5cb',1,'cv::MatExpr::max(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6dff8b6e9105b6d817b493e7be157c90',1,'cv::MatExpr::max(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0326ec178e9d4ca09c54b6b488fb8021',1,'cv::MatExpr::max(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4a2fa0a37cba3f21b576ae4084757fba',1,'cv::MatExpr::max(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acb1ea96bb76c4014c399ef6ba536a7b0',1,'cv::MatExpr::max(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8ee69a65a23b73a176ab5ef9a6e5d5cb',1,'cv::MatExpr::max(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/da/d81/structcv_1_1cudev_1_1numeric__limits_3_01bool_01_4.html#ac703275292abf4e807a214591bcdc2d8',1,'cv::cudev::numeric_limits< bool >::max()'],['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html#a975e4945dd32c2d4d81754a930de6b32',1,'cv::cudev::numeric_limits< double >::max()'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html#a4c00407dc7ea3ba6b40e4304029889a2',1,'cv::cudev::numeric_limits< float >::max()'],['https://docs.opencv.org/4.2.0/da/d4e/structcv_1_1cudev_1_1numeric__limits_3_01schar_01_4.html#aa062933ff7ca9cac2696d885e0a395eb',1,'cv::cudev::numeric_limits< schar >::max()'],['https://docs.opencv.org/4.2.0/d1/d8b/structcv_1_1cudev_1_1numeric__limits_3_01short_01_4.html#a20f0d37fa674c928c9511f6862a0cb4e',1,'cv::cudev::numeric_limits< short >::max()'],['https://docs.opencv.org/4.2.0/d3/dc7/structcv_1_1cudev_1_1numeric__limits_3_01uchar_01_4.html#a5ca8ea65e60c6da8c38058728816a00b',1,'cv::cudev::numeric_limits< uchar >::max()'],['https://docs.opencv.org/4.2.0/dd/d89/structcv_1_1cudev_1_1numeric__limits_3_01uint_01_4.html#a1a620ff9c217ea83b33e76a4402c59d9',1,'cv::cudev::numeric_limits< uint >::max()'],['https://docs.opencv.org/4.2.0/df/d47/structcv_1_1cudev_1_1numeric__limits_3_01ushort_01_4.html#a03563b99fdf8162fb1bdd44f26dce122',1,'cv::cudev::numeric_limits< ushort >::max()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3d08b6f078ecee3862aeb01bdf0ba8b9',1,'cv::softdouble::max()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6361d683afa3e472e06a0c2e80984f00',1,'cv::softfloat::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ae00d7ad063d15bb7162da61116552175',1,'gamma_distribution< double >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ae00d7ad063d15bb7162da61116552175',1,'gamma_distribution< result_type >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8e9cd7d4bb14de188ead958d3f1faeac',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae433f04f988a93f6e835d7cf7fbbde31',1,'normal_distribution< double >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae433f04f988a93f6e835d7cf7fbbde31',1,'normal_distribution< result_type >::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#a14712b344c9472eb67d2973589ddf7f2',1,'std::bernoulli_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a3699dfeea620a15824d48f712df52b0c',1,'std::binomial_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#ae5cd7dd82c78d0383e64cd19e0234c86',1,'std::cauchy_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#ab4889a7bcb116a19e0815cf2fa250263',1,'std::chi_squared_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a9a70eb71021b6dd2b675e158d76833ef',1,'std::discard_block_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a3e8e124e8cdf1f8d18b1838a5d1c9728',1,'std::discrete_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#ac4d57abc4ee818a817139259105ef090',1,'std::exponential_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#ade74f06d6ad6c6f14c988fea1b63c1bb',1,'std::extreme_value_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a06d2101e5cda9129c6632e788fe7b9b8',1,'std::fisher_f_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#ae00d7ad063d15bb7162da61116552175',1,'std::gamma_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a537ddec1681bac5e12dd0aab79983072',1,'std::geometric_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#abf1815a0f69ac213aeeac81d614371e2',1,'std::independent_bits_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#af334bf0422c2d5ef522e3dac8427d63a',1,'std::linear_congruential_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#ae51c9700b0c6168babb2abdf188e50d0',1,'std::lognormal_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8e9cd7d4bb14de188ead958d3f1faeac',1,'std::mersenne_twister_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#ab6d71a4f655a8dc7b6c15f86eed3c497',1,'std::negative_binomial_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae433f04f988a93f6e835d7cf7fbbde31',1,'std::normal_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#a27b481b529885d1b1b714c7fe69a1945',1,'std::numeric_limits::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a343aaa0cdc636a60b6e224055d9df438',1,'std::piecewise_constant_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a469645104ba3c002ed9ca944110dfe2a',1,'std::piecewise_linear_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#aaba081a4614ee3ff72039cae6a476267',1,'std::poisson_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a1d0bd67aff4969f4a202719edd2c4f5b',1,'std::shuffle_order_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a3aa9a19c585c414c605558b3af9a86ec',1,'std::student_t_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#aeea39effc4518e2236214b51cc0e9f93',1,'std::subtract_with_carry_engine::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#aa54fab480296167c634342e2f0222ef7',1,'std::uniform_int_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#aa66df100cde48499a2ba6b2cca3d1554',1,'std::uniform_real_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4e66ea69757ab2d6193e385c919e6f71',1,'std::valarray::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#ab2f82c4a4ca1feff71630626710d865e',1,'std::weibull_distribution::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4e66ea69757ab2d6193e385c919e6f71',1,'valarray< size_t >::max()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a0e0a35eb40a9079468f447c1bab8a400',1,'Eigen::AlignedBox::max()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a987d516532b24fcadc34d2f501579c73',1,'Eigen::AlignedBox::max() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga78f988f6cfa6223610298cbd4f86ec66',1,'cv::max(const softfloat &a, const softfloat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga07f4a159313983528c74d5162a56fbc9',1,'cv::max(const softdouble &a, const softdouble &b)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gacc40fa15eac0fb83f8ca70b7cc0b588d',1,'cv::max(InputArray src1, InputArray src2, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad81c37ed0b0fd23ede0cefadbf04af44',1,'cv::max(const Mat &src1, const Mat &src2, Mat &dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6eefd595055bf1ea4ba3d12f70531511',1,'cv::max(const UMat &src1, const UMat &src2, UMat &dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gadb5dd3d870f10c0866035755b929b1e7',1,'cv::cuda::max()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7edae1e0cfcb34a59e251c9b330949',1,'cv::cudev::max(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff9681cddad025c92c98529215adacb',1,'cv::cudev::max(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6432d74919e90dbda4727df485d68878',1,'cv::cudev::max(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae250eaed4ac6113528a0590afe45b099',1,'cv::cudev::max(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bd06dc616da56d71d6f238772e921e',1,'cv::cudev::max(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd2a8c631c77af12548b22aaacebc87a',1,'cv::cudev::max(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf5c19898fc50d657385caeca1ca1ede',1,'cv::cudev::max(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3763f4140dbd3501a732882e48c5102c',1,'cv::cudev::max(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8946999942e013d38872e231417093a0',1,'cv::cudev::max(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db3b60a0cbe9bc77ad3e698954a9c18',1,'cv::cudev::max(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga634efcb854017039414da832695a2533',1,'cv::cudev::max(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4adf20946d2403cdc84854e778d03a9a',1,'cv::cudev::max(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9c563261c87743c5dab045a91a61c7c',1,'cv::cudev::max(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae17404884a5f0ef7eaf56225fb604fe6',1,'cv::cudev::max(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ce2d615591426d5adb4764996698b9',1,'cv::cudev::max(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bf33fe22d6e7efb9e5faacbba1c6a45',1,'cv::cudev::max(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf91add376317b3731608216f28ab963',1,'cv::cudev::max(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0053e35915c820454ea2264d4ee7613f',1,'cv::cudev::max(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62698a80e29b75ec8505358a3799936e',1,'cv::cudev::max(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bce6ab7cccef843a7c944bbdbf63b07',1,'cv::cudev::max(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b384425584ac7c2d34bdc057e5af65',1,'cv::cudev::max(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d199235971dff02dc2959f563d23308',1,'cv::cudev::max(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga327485d656538e5fa100c599c75a1e00',1,'cv::cudev::max(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a96f99c184fabb74382774232aa3a34',1,'cv::cudev::max(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1015f0bfdd3bb605e0e9d1fd147e1df4',1,'cv::cudev::max(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bd5ed74854a11a09051de2954f15ed5',1,'cv::cudev::max(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e265a5d6affec6d1afbd2ef5f14e06',1,'cv::cudev::max(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa886e0915a0f68093092573066797ad',1,'cv::cudev::max(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49797f16c920f5d36c3174510dec72ea',1,'cv::cudev::max(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70201802b3cf2254a774fcd6a556772c',1,'cv::cudev::max(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6460dd389b726df9bb0a7bcfbdc759de',1,'cv::cudev::max(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76dd5f19b86e2c63bbd784ce53d8c3d5',1,'cv::cudev::max(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20343d119b1183a8e2c86859ebf509a0',1,'cv::cudev::max(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17935472e8616fd215d00f74958ff148',1,'cv::cudev::max(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5ac8be6bbe25ea472a8b035ca898d4',1,'cv::cudev::max(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cf8fa19265b62e66cabe413af3e98af',1,'cv::cudev::max(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga365449d2ee70ebad2e967ded65012d9f',1,'cv::cudev::max(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe20c764e1d3494e66d66bb79edd752b',1,'cv::cudev::max(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6908e25c314e9a522c4b81cd3b11b0e6',1,'cv::cudev::max(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabea3829667cf61d6d87ff887a0b62656',1,'cv::cudev::max(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f137995b4f2d9eb06126a5cfdd0b50',1,'cv::cudev::max(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga108f8c6df21015b48c0599f93404be91',1,'cv::cudev::max(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb469b3fb7117158fcfab61b99dd18fa',1,'cv::cudev::max(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0acbba9ca0c69f0393eb530b2f3086dc',1,'cv::cudev::max(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f53bfb32250efe690ddf916e22abc28',1,'cv::cudev::max(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74726357f2915b6368219138b4025fcc',1,'cv::cudev::max(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13b69add5d5f7e0a7b08d70c58628078',1,'cv::cudev::max(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea3eb5bf693497dea32ded82af090fdd',1,'cv::cudev::max(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae109b4e7ada4529f21451575bd6abeb7',1,'cv::cudev::max(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga590088e5ce5ec5e4ed714b4cce952e7f',1,'cv::cudev::max(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31b2a6f5dd43d410fd15868e6c0f280a',1,'cv::cudev::max(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99cb5e202087eaa0b229d3cf230728d1',1,'cv::cudev::max(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb8f76636a19b20fcb0210361532c2c',1,'cv::cudev::max(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095daa3a23199e024436979238b6bbd',1,'cv::cudev::max(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga813e1d83b09e82844b86d1353a77d748',1,'cv::cudev::max(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3cb3bca7308191b5700f530fa34ca',1,'cv::cudev::max(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d59e76ba65008f3b6b6b24b94d29ef',1,'cv::cudev::max(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3448076586183d18e39c7974dd70c8',1,'cv::cudev::max(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b97852d88c33eb05ee8831f2092012f',1,'cv::cudev::max(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12a59c2315768e81cd56da5cae21f33c',1,'cv::cudev::max(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c50fae74b2eaf9f75402c6f3f815b4',1,'cv::cudev::max(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e080dce49fa6b5ea358a2258bb629c6',1,'cv::cudev::max(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga024f510b15b88ba5c7424f3d491e75b7',1,'cv::cudev::max(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fc9392d7d60b78635d0c74636408fa6',1,'cv::cudev::max(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2097bf067a2cd8b1fb3ca5a314002c34',1,'cv::cudev::max(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21d3728ff2ae2aa507b6126bbdd1504a',1,'cv::cudev::max(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae35a8be3fd1df938eb2434db4ff5d6e1',1,'cv::cudev::max(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52c58c71c1b59d7072442a8bd2b47bce',1,'cv::cudev::max(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a9e142727b6a1dda24772209649785',1,'cv::cudev::max(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8f9e1e0e8752a30a78603922dc17e01',1,'cv::cudev::max(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga611a70849906e1ae3c0aa9e756cfb8de',1,'cv::cudev::max(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57333c18e7c065708d6ac3a6f68f6df3',1,'cv::cudev::max(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7da28fa160b61ce66315922672f10592',1,'cv::cudev::max(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7415c5b61082b4b9c7c2122f269a1e60',1,'cv::cudev::max(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga226f005c8e0685c696bc3b340f2913a3',1,'cv::cudev::max(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7e33b43b4a4e457011d464eb94a5d96',1,'cv::cudev::max(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8288851d3304269c3ff9ae788264de83',1,'cv::cudev::max(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea853b43ad12529c0afecebe3e75f33a',1,'cv::cudev::max(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa798788a3437d78a74ca1dc04e4b832e',1,'cv::cudev::max(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga984b7fb4be9bcb23c751e79824907172',1,'cv::cudev::max(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2ae1b02759bc502a2f9f0e1918fa61c',1,'cv::cudev::max(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09d4d1ecf2a01d8a04bfb6faed58ca75',1,'cv::cudev::max(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ffe50e3856a9c0ef216c9c2cc8ef88',1,'cv::cudev::max(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ef1167e26453336dfc63d860a92f2',1,'cv::cudev::max(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga054b13d0e5d1196e5c64aeafc35eda9d',1,'cv::cudev::max(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b7e9961d85c9275ca9797e2a7d492b',1,'cv::cudev::max(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cc953644000cdd73756355d21f65035',1,'cv::cudev::max(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga798df13ec7d9c0bfd7e87e9205fbe20e',1,'cv::cudev::max(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0d3731aadd1cd52d1497476d249c411',1,'cv::cudev::max(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12ed50409cb498ca954657e6d56e0aef',1,'cv::cudev::max(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03bdb4845489b77a0ec85e7db2116d8b',1,'cv::cudev::max(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b0eef253e07a5d3c8eb891aa0150ab4',1,'cv::cudev::max(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac81a538d91716632a351a3315bb27a',1,'cv::cudev::max(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a344c714483b3b153d094e38ab69ab',1,'cv::cudev::max(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc2afd9d000eb685e979e691c41efd8',1,'cv::cudev::max(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6417ca2883d855805c090de4b04a92cf',1,'cv::cudev::max(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ad7e5cdef23ce3709ab800afdab3a6',1,'cv::cudev::max(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae90057ec7319796e7dcfd7af28027386',1,'cv::cudev::max(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga057d8e2732db88e8f676b2f638127717',1,'cv::cudev::max(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cf8fba0ece505e1b05405af25c6de92',1,'cv::cudev::max(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga464718ee489ad5f8e1c9b575e510dec0',1,'cv::cudev::max(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c5c137d283d4daacfba1473b10b5541',1,'cv::cudev::max(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2082fcc1d0c81f321f78c10583f9e088',1,'cv::cudev::max(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0f9db015b2f6295ac50e0981442eccf',1,'cv::cudev::max(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d3a74e6af64be7dfeffbc8242c24c21',1,'cv::cudev::max(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfc39d6227d9b78470d511a20f948807',1,'cv::cudev::max(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d901c104487bf31776724581aac418a',1,'cv::cudev::max(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e805de45dbf65b56e332ac2b64bc8c8',1,'cv::cudev::max(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3642852f0e37cc6b223048baedb89b23',1,'cv::cudev::max(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8954cb6a927557a3afcbe7f53a47d0f',1,'cv::cudev::max(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f2ab33db68c0db0ea3490da34d41f6',1,'cv::cudev::max(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9b2181ee4a6be9ea8de2da75f821d4b',1,'cv::cudev::max(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8a6a48caa4e6ec56a6df3cbf6ee88ad',1,'cv::cudev::max(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4114f5fa4b6a1defced1ff6f09e99a77',1,'cv::cudev::max(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga709da4137ee804a37a3bf9897f81a54f',1,'cv::cudev::max(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga745f7c1a67b75924005059bdadfad059',1,'cv::cudev::max(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23cd6e3768da75d63ee2c772721547b5',1,'cv::cudev::max(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3535e57152bb9bb870cc80641924d968',1,'cv::cudev::max(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac75fd5ed788efc158eadfad05909768b',1,'cv::cudev::max(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bc01dd4cae5bc8f5d0fbbe41894e38c',1,'cv::cudev::max(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedb902f8f075950428f149f3ae6e8368',1,'cv::cudev::max(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42077dd2a8bbd9426871e1e6100bb88a',1,'cv::cudev::max(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c461a61928c807cfcbb35e05328a9f',1,'cv::cudev::max(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53b91c1178649b59ce12e5b7e3cd9f3b',1,'cv::cudev::max(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78ce5713c65e22a601075d719a9c78bc',1,'cv::cudev::max(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c69369e7994b7c797c2c7e251111d3',1,'cv::cudev::max(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf02f0270ebf0e09528142c25810f089e',1,'cv::cudev::max(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7cf77af63bb9be60fbe892722e899',1,'cv::cudev::max(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga016da0e12302e3a9a75ac629fd4711a6',1,'cv::cudev::max(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab90a61e27bbf62122d6d1630791f69e0',1,'cv::cudev::max(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0052ef1d3ba6d7a3b9ab72ca6527a9d0',1,'cv::cudev::max(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga833b26b174d46e6eb2983a845389f414',1,'cv::cudev::max(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f23d4191d045b10de43a72d2b9e2ab',1,'cv::cudev::max(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b690732c1fc4757ef340044ecfc4489',1,'cv::cudev::max(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe962f22e136477e81f50bfe84c27369',1,'cv::cudev::max(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ee23973c69d923d4dc293194ced992',1,'cv::cudev::max(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e1f15f8dd8f0672a29b786211703d3e',1,'cv::cudev::max(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9860c259c810cab9f11ca560b7ed50',1,'cv::cudev::max(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32870871b640f6b22406ec31171a7316',1,'cv::cudev::max(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad63be246086568453d852849a3323420',1,'cv::cudev::max(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20aac3e422e4cb8c3b7e5e70c1d14423',1,'cv::cudev::max(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc21c02538e0d716e033a0f60bd07ed7',1,'cv::cudev::max(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa8424d806478f3ec1226b9de554a54',1,'cv::cudev::max(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0427ef988e84eb62ff762dc5ece814c6',1,'cv::cudev::max(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc917089df0cae9685a241d7410d0d37',1,'cv::cudev::max(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed2f554315d00fe5e6787519fa821c7',1,'cv::cudev::max(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b345faefa99feef763db27ada3d285',1,'cv::cudev::max(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga602d4e347cb5bb2d3e0eacc8a185ab64',1,'cv::cudev::max(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a9f8491e0461da68dacc563649708c',1,'cv::cudev::max(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafb5251a655b274d9ad94130f58de64c',1,'cv::cudev::max(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab87360125776b39906941203e1b01988',1,'cv::cudev::max(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8116d6776ef06f4ce0decc7e25bb5471',1,'cv::cudev::max(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d496f6f0b4656db91a8ca8e6c533c9',1,'cv::cudev::max(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13bcfe8e2f5abff4acd6bb4b2f600d77',1,'cv::cudev::max(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga936cf9ff339de81e4c74b518a0356fed',1,'cv::cudev::max(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1a4045b1aba6742c364d17b98249ce6',1,'cv::cudev::max(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0149a2b69e6f49dc2138fbce981230b',1,'cv::cudev::max(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf93df076678da531781417d10b9cbbf',1,'cv::cudev::max(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db835d025ae8e27f82dc4c951e54bef',1,'cv::cudev::max(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9a1fdaaac965358a6f82c190302c6bf',1,'cv::cudev::max(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fbfaa00be80acd28eea2d9597ef58fc',1,'cv::cudev::max(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfbe7499b071b13a107e80a187b44e18',1,'cv::cudev::max(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79aa095d6cb5bcf6580bdf2766f33ab9',1,'cv::cudev::max(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf786b3d507ec79af09f1ff37fa58525',1,'cv::cudev::max(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga371a082668f40b2910437b066d610194',1,'cv::cudev::max(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3dda6876d0ddb4a6cc7a91c52d76c08',1,'cv::cudev::max(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7211b847fa77ba43a4274ddbc97ebd',1,'cv::cudev::max(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga620a0b36ae5d9f37970db813f4e8dad6',1,'cv::cudev::max(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7ddc4d5890f821cb280d7425ce5c74',1,'cv::cudev::max(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8f397fce7b658287fd0719a7197036',1,'cv::cudev::max(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81a2eeb9b0dc3148e6e93b297fe4e7e0',1,'cv::cudev::max(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga475f92091db274dbbb70a7706d0d0c40',1,'cv::cudev::max(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga859fcb1f96519a0148e0286f77a98569',1,'cv::cudev::max(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4e298eee324f7998e2f9ad32fdc362',1,'cv::cudev::max(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fa4a50a11b12e71a4b5971db09daed7',1,'cv::cudev::max(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29fd18d8e44839d3003b25e7c2be9f88',1,'cv::cudev::max(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga432a2fa36fadc150cd6a2b953e68362e',1,'cv::cudev::max(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a0a22941a27212e0a2ce3ced4b6ce23',1,'cv::cudev::max(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37c1b4a34f412f4f9a3b151f13a73db0',1,'cv::cudev::max(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86216fa87809ccfc51828718c5c42431',1,'cv::cudev::max(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3ab9e4e16dc195499a754530f4e7696',1,'cv::cudev::max(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3caf6dbeefcc40b730b67f8a21584d47',1,'cv::cudev::max(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65ff60ad91763997812d3721ff9b4ce9',1,'cv::cudev::max(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0cd4e99dd1837208bb030e4de8239ba',1,'cv::cudev::max(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec0cfaea38a71f6439a84dd49181e73d',1,'cv::cudev::max(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73baf05ed230e047e8b1a4a2cc883168',1,'cv::cudev::max(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6e726e28a344d15ba4f74e9b3a624bf',1,'cv::cudev::max(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39231493f16b86d7850dde970bfc35de',1,'cv::cudev::max(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6c1b774c5b7a8e2dfd6f4ebb46329ab',1,'cv::cudev::max(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628a75ac09a15e078f60b2ff10091794',1,'cv::cudev::max(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8833c4e522d0818abcfbaed896c9830',1,'cv::cudev::max(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7feb89effc24d3e37cd28dbe3e7b645',1,'cv::cudev::max(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga727b7d3d95fff67e0a602255e3b31f1f',1,'cv::cudev::max(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga097408aee5dc871470963d6f0a1ff929',1,'cv::cudev::max(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e3c84204b34ce3d42a85a20fe00a57c',1,'cv::cudev::max(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e0f041f44d4dfe49cfd4b47a3f82377',1,'cv::cudev::max(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaac935d91a102285989be110a5acfeb',1,'cv::cudev::max(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9ab71229973969fae54bd11d59236e6',1,'cv::cudev::max(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad143763f595cbe3d51d5d0e024939f4c',1,'cv::cudev::max(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac468f9c2a30559c3c66a33fa44eb0618',1,'cv::cudev::max(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga0ff081ea80eb39a96389c16ac0f9e944',1,'cv::gapi::max()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gacc40fa15eac0fb83f8ca70b7cc0b588d',1,'max(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gad81c37ed0b0fd23ede0cefadbf04af44',1,'max(const Mat &src1, const Mat &src2, Mat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga6eefd595055bf1ea4ba3d12f70531511',1,'max(const UMat &src1, const UMat &src2, UMat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6361d683afa3e472e06a0c2e80984f00',1,'max()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga78f988f6cfa6223610298cbd4f86ec66',1,'max(const softfloat &a, const softfloat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga07f4a159313983528c74d5162a56fbc9',1,'max(const softdouble &a, const softdouble &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#ga0ff081ea80eb39a96389c16ac0f9e944',1,'max(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#gadb5dd3d870f10c0866035755b929b1e7',1,'max(InputArray src1, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7edae1e0cfcb34a59e251c9b330949',1,'max(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff9681cddad025c92c98529215adacb',1,'max(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6432d74919e90dbda4727df485d68878',1,'max(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae250eaed4ac6113528a0590afe45b099',1,'max(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bd06dc616da56d71d6f238772e921e',1,'max(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd2a8c631c77af12548b22aaacebc87a',1,'max(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf5c19898fc50d657385caeca1ca1ede',1,'max(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3763f4140dbd3501a732882e48c5102c',1,'max(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8946999942e013d38872e231417093a0',1,'max(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db3b60a0cbe9bc77ad3e698954a9c18',1,'max(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga634efcb854017039414da832695a2533',1,'max(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4adf20946d2403cdc84854e778d03a9a',1,'max(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9c563261c87743c5dab045a91a61c7c',1,'max(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae17404884a5f0ef7eaf56225fb604fe6',1,'max(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ce2d615591426d5adb4764996698b9',1,'max(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bf33fe22d6e7efb9e5faacbba1c6a45',1,'max(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf91add376317b3731608216f28ab963',1,'max(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0053e35915c820454ea2264d4ee7613f',1,'max(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62698a80e29b75ec8505358a3799936e',1,'max(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bce6ab7cccef843a7c944bbdbf63b07',1,'max(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b384425584ac7c2d34bdc057e5af65',1,'max(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d199235971dff02dc2959f563d23308',1,'max(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga327485d656538e5fa100c599c75a1e00',1,'max(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a96f99c184fabb74382774232aa3a34',1,'max(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1015f0bfdd3bb605e0e9d1fd147e1df4',1,'max(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bd5ed74854a11a09051de2954f15ed5',1,'max(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e265a5d6affec6d1afbd2ef5f14e06',1,'max(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa886e0915a0f68093092573066797ad',1,'max(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49797f16c920f5d36c3174510dec72ea',1,'max(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70201802b3cf2254a774fcd6a556772c',1,'max(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6460dd389b726df9bb0a7bcfbdc759de',1,'max(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76dd5f19b86e2c63bbd784ce53d8c3d5',1,'max(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20343d119b1183a8e2c86859ebf509a0',1,'max(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17935472e8616fd215d00f74958ff148',1,'max(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5ac8be6bbe25ea472a8b035ca898d4',1,'max(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cf8fa19265b62e66cabe413af3e98af',1,'max(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga365449d2ee70ebad2e967ded65012d9f',1,'max(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe20c764e1d3494e66d66bb79edd752b',1,'max(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6908e25c314e9a522c4b81cd3b11b0e6',1,'max(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabea3829667cf61d6d87ff887a0b62656',1,'max(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f137995b4f2d9eb06126a5cfdd0b50',1,'max(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga108f8c6df21015b48c0599f93404be91',1,'max(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb469b3fb7117158fcfab61b99dd18fa',1,'max(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0acbba9ca0c69f0393eb530b2f3086dc',1,'max(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f53bfb32250efe690ddf916e22abc28',1,'max(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74726357f2915b6368219138b4025fcc',1,'max(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13b69add5d5f7e0a7b08d70c58628078',1,'max(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea3eb5bf693497dea32ded82af090fdd',1,'max(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae109b4e7ada4529f21451575bd6abeb7',1,'max(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga590088e5ce5ec5e4ed714b4cce952e7f',1,'max(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31b2a6f5dd43d410fd15868e6c0f280a',1,'max(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99cb5e202087eaa0b229d3cf230728d1',1,'max(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb8f76636a19b20fcb0210361532c2c',1,'max(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095daa3a23199e024436979238b6bbd',1,'max(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga813e1d83b09e82844b86d1353a77d748',1,'max(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3cb3bca7308191b5700f530fa34ca',1,'max(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d59e76ba65008f3b6b6b24b94d29ef',1,'max(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3448076586183d18e39c7974dd70c8',1,'max(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b97852d88c33eb05ee8831f2092012f',1,'max(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12a59c2315768e81cd56da5cae21f33c',1,'max(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c50fae74b2eaf9f75402c6f3f815b4',1,'max(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e080dce49fa6b5ea358a2258bb629c6',1,'max(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga024f510b15b88ba5c7424f3d491e75b7',1,'max(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fc9392d7d60b78635d0c74636408fa6',1,'max(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2097bf067a2cd8b1fb3ca5a314002c34',1,'max(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21d3728ff2ae2aa507b6126bbdd1504a',1,'max(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae35a8be3fd1df938eb2434db4ff5d6e1',1,'max(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52c58c71c1b59d7072442a8bd2b47bce',1,'max(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a9e142727b6a1dda24772209649785',1,'max(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8f9e1e0e8752a30a78603922dc17e01',1,'max(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga611a70849906e1ae3c0aa9e756cfb8de',1,'max(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57333c18e7c065708d6ac3a6f68f6df3',1,'max(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7da28fa160b61ce66315922672f10592',1,'max(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7415c5b61082b4b9c7c2122f269a1e60',1,'max(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga226f005c8e0685c696bc3b340f2913a3',1,'max(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7e33b43b4a4e457011d464eb94a5d96',1,'max(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8288851d3304269c3ff9ae788264de83',1,'max(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea853b43ad12529c0afecebe3e75f33a',1,'max(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa798788a3437d78a74ca1dc04e4b832e',1,'max(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga984b7fb4be9bcb23c751e79824907172',1,'max(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2ae1b02759bc502a2f9f0e1918fa61c',1,'max(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09d4d1ecf2a01d8a04bfb6faed58ca75',1,'max(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ffe50e3856a9c0ef216c9c2cc8ef88',1,'max(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ef1167e26453336dfc63d860a92f2',1,'max(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga054b13d0e5d1196e5c64aeafc35eda9d',1,'max(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b7e9961d85c9275ca9797e2a7d492b',1,'max(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cc953644000cdd73756355d21f65035',1,'max(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga798df13ec7d9c0bfd7e87e9205fbe20e',1,'max(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0d3731aadd1cd52d1497476d249c411',1,'max(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12ed50409cb498ca954657e6d56e0aef',1,'max(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03bdb4845489b77a0ec85e7db2116d8b',1,'max(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b0eef253e07a5d3c8eb891aa0150ab4',1,'max(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac81a538d91716632a351a3315bb27a',1,'max(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a344c714483b3b153d094e38ab69ab',1,'max(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc2afd9d000eb685e979e691c41efd8',1,'max(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6417ca2883d855805c090de4b04a92cf',1,'max(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ad7e5cdef23ce3709ab800afdab3a6',1,'max(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae90057ec7319796e7dcfd7af28027386',1,'max(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga057d8e2732db88e8f676b2f638127717',1,'max(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cf8fba0ece505e1b05405af25c6de92',1,'max(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga464718ee489ad5f8e1c9b575e510dec0',1,'max(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c5c137d283d4daacfba1473b10b5541',1,'max(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2082fcc1d0c81f321f78c10583f9e088',1,'max(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0f9db015b2f6295ac50e0981442eccf',1,'max(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d3a74e6af64be7dfeffbc8242c24c21',1,'max(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfc39d6227d9b78470d511a20f948807',1,'max(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d901c104487bf31776724581aac418a',1,'max(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e805de45dbf65b56e332ac2b64bc8c8',1,'max(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3642852f0e37cc6b223048baedb89b23',1,'max(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8954cb6a927557a3afcbe7f53a47d0f',1,'max(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f2ab33db68c0db0ea3490da34d41f6',1,'max(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9b2181ee4a6be9ea8de2da75f821d4b',1,'max(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8a6a48caa4e6ec56a6df3cbf6ee88ad',1,'max(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4114f5fa4b6a1defced1ff6f09e99a77',1,'max(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga709da4137ee804a37a3bf9897f81a54f',1,'max(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga745f7c1a67b75924005059bdadfad059',1,'max(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23cd6e3768da75d63ee2c772721547b5',1,'max(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3535e57152bb9bb870cc80641924d968',1,'max(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac75fd5ed788efc158eadfad05909768b',1,'max(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bc01dd4cae5bc8f5d0fbbe41894e38c',1,'max(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedb902f8f075950428f149f3ae6e8368',1,'max(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42077dd2a8bbd9426871e1e6100bb88a',1,'max(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c461a61928c807cfcbb35e05328a9f',1,'max(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53b91c1178649b59ce12e5b7e3cd9f3b',1,'max(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78ce5713c65e22a601075d719a9c78bc',1,'max(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6c69369e7994b7c797c2c7e251111d3',1,'max(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf02f0270ebf0e09528142c25810f089e',1,'max(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7cf77af63bb9be60fbe892722e899',1,'max(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga016da0e12302e3a9a75ac629fd4711a6',1,'max(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab90a61e27bbf62122d6d1630791f69e0',1,'max(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0052ef1d3ba6d7a3b9ab72ca6527a9d0',1,'max(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga833b26b174d46e6eb2983a845389f414',1,'max(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f23d4191d045b10de43a72d2b9e2ab',1,'max(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b690732c1fc4757ef340044ecfc4489',1,'max(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe962f22e136477e81f50bfe84c27369',1,'max(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ee23973c69d923d4dc293194ced992',1,'max(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e1f15f8dd8f0672a29b786211703d3e',1,'max(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9860c259c810cab9f11ca560b7ed50',1,'max(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32870871b640f6b22406ec31171a7316',1,'max(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad63be246086568453d852849a3323420',1,'max(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20aac3e422e4cb8c3b7e5e70c1d14423',1,'max(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc21c02538e0d716e033a0f60bd07ed7',1,'max(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa8424d806478f3ec1226b9de554a54',1,'max(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0427ef988e84eb62ff762dc5ece814c6',1,'max(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc917089df0cae9685a241d7410d0d37',1,'max(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed2f554315d00fe5e6787519fa821c7',1,'max(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b345faefa99feef763db27ada3d285',1,'max(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga602d4e347cb5bb2d3e0eacc8a185ab64',1,'max(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a9f8491e0461da68dacc563649708c',1,'max(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafb5251a655b274d9ad94130f58de64c',1,'max(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab87360125776b39906941203e1b01988',1,'max(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8116d6776ef06f4ce0decc7e25bb5471',1,'max(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d496f6f0b4656db91a8ca8e6c533c9',1,'max(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13bcfe8e2f5abff4acd6bb4b2f600d77',1,'max(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga936cf9ff339de81e4c74b518a0356fed',1,'max(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1a4045b1aba6742c364d17b98249ce6',1,'max(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0149a2b69e6f49dc2138fbce981230b',1,'max(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf93df076678da531781417d10b9cbbf',1,'max(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db835d025ae8e27f82dc4c951e54bef',1,'max(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9a1fdaaac965358a6f82c190302c6bf',1,'max(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fbfaa00be80acd28eea2d9597ef58fc',1,'max(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfbe7499b071b13a107e80a187b44e18',1,'max(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79aa095d6cb5bcf6580bdf2766f33ab9',1,'max(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf786b3d507ec79af09f1ff37fa58525',1,'max(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga371a082668f40b2910437b066d610194',1,'max(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3dda6876d0ddb4a6cc7a91c52d76c08',1,'max(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7211b847fa77ba43a4274ddbc97ebd',1,'max(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga620a0b36ae5d9f37970db813f4e8dad6',1,'max(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b7ddc4d5890f821cb280d7425ce5c74',1,'max(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8f397fce7b658287fd0719a7197036',1,'max(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81a2eeb9b0dc3148e6e93b297fe4e7e0',1,'max(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga475f92091db274dbbb70a7706d0d0c40',1,'max(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga859fcb1f96519a0148e0286f77a98569',1,'max(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4e298eee324f7998e2f9ad32fdc362',1,'max(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fa4a50a11b12e71a4b5971db09daed7',1,'max(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29fd18d8e44839d3003b25e7c2be9f88',1,'max(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga432a2fa36fadc150cd6a2b953e68362e',1,'max(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a0a22941a27212e0a2ce3ced4b6ce23',1,'max(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37c1b4a34f412f4f9a3b151f13a73db0',1,'max(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86216fa87809ccfc51828718c5c42431',1,'max(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3ab9e4e16dc195499a754530f4e7696',1,'max(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3caf6dbeefcc40b730b67f8a21584d47',1,'max(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65ff60ad91763997812d3721ff9b4ce9',1,'max(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0cd4e99dd1837208bb030e4de8239ba',1,'max(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec0cfaea38a71f6439a84dd49181e73d',1,'max(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73baf05ed230e047e8b1a4a2cc883168',1,'max(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6e726e28a344d15ba4f74e9b3a624bf',1,'max(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39231493f16b86d7850dde970bfc35de',1,'max(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6c1b774c5b7a8e2dfd6f4ebb46329ab',1,'max(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628a75ac09a15e078f60b2ff10091794',1,'max(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8833c4e522d0818abcfbaed896c9830',1,'max(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7feb89effc24d3e37cd28dbe3e7b645',1,'max(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga727b7d3d95fff67e0a602255e3b31f1f',1,'max(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga097408aee5dc871470963d6f0a1ff929',1,'max(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e3c84204b34ce3d42a85a20fe00a57c',1,'max(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e0f041f44d4dfe49cfd4b47a3f82377',1,'max(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaac935d91a102285989be110a5acfeb',1,'max(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9ab71229973969fae54bd11d59236e6',1,'max(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad143763f595cbe3d51d5d0e024939f4c',1,'max(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac468f9c2a30559c3c66a33fa44eb0618',1,'max(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#aa05dc1fa1f8a513888fd311ea7b39aa3',1,'__gnu_parallel::max()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga84d30d8c4b3f2cbe8ec2055c34a578da',1,'std::max(const _Tp &__a, const _Tp &__b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga2a22232a7bcd3b1f87a45a5fb01ac9c3',1,'std::max(const _Tp &__a, const _Tp &__b, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4e66ea69757ab2d6193e385c919e6f71',1,'max() const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga84d30d8c4b3f2cbe8ec2055c34a578da',1,'max(const _Tp &__a, const _Tp &__b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga2a22232a7bcd3b1f87a45a5fb01ac9c3',1,'max(const _Tp &__a, const _Tp &__b, _Compare __comp)(Global Namespace)']]], + ['max16s_114',['max16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66336453cd904ddef80b325b92626610',1,'cv::hal::max16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga66336453cd904ddef80b325b92626610',1,'max16s()(Global Namespace)']]], + ['max16u_115',['max16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga601826ce6352e8b85eb260be8b85c7a6',1,'cv::hal::max16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga601826ce6352e8b85eb260be8b85c7a6',1,'max16u()(Global Namespace)']]], + ['max32f_116',['max32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga4652f0687a917b049d22a466adb4c18e',1,'cv::hal::max32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga4652f0687a917b049d22a466adb4c18e',1,'max32f()(Global Namespace)']]], + ['max32s_117',['max32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6738c923e01c515b9c3be8329adf5494',1,'cv::hal::max32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6738c923e01c515b9c3be8329adf5494',1,'max32s()(Global Namespace)']]], + ['max64f_118',['max64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9283f7d52b658ea4c9b59652d9f0a173',1,'cv::hal::max64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga9283f7d52b658ea4c9b59652d9f0a173',1,'max64f()(Global Namespace)']]], + ['max8s_119',['max8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacc4819891df74719567179051e911e2b',1,'cv::hal::max8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacc4819891df74719567179051e911e2b',1,'max8s()(Global Namespace)']]], + ['max8u_120',['max8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac92f2f18733b6f8ac7692da669252906',1,'cv::hal::max8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gac92f2f18733b6f8ac7692da669252906',1,'max8u()(Global Namespace)']]], + ['max_5f_121',['max_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41470dd8d5f61c2020ab8672a483838',1,'cv::cudev::max_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41470dd8d5f61c2020ab8672a483838',1,'max_()(Global Namespace)']]], + ['max_5fbucket_5fcount_122',['max_bucket_count',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af29f5a18a09a36adb720b6907e45eacd',1,'std::unordered_map::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a193e48c36ac0f5888911cf991428a287',1,'std::unordered_multimap::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#abc4c192168d4217376439dce87cf12a2',1,'std::unordered_multiset::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#afc90e16afa79bd929b49590dc8637b00',1,'std::unordered_set::max_bucket_count()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#af29f5a18a09a36adb720b6907e45eacd',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_bucket_count()']]], + ['max_5felement_123',['max_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6c310c6d1db64624d3097dd06838ef9b',1,'std::max_element(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gab0bc7a1a77eead2e4af61c6506230104',1,'std::max_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6c310c6d1db64624d3097dd06838ef9b',1,'max_element(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gab0bc7a1a77eead2e4af61c6506230104',1,'max_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], + ['max_5fload_5ffactor_124',['max_load_factor',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae2f58d908f2e03656fce158550d9ba73',1,'std::unordered_map::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0584274b6378b6d962debbe96f5c5cb6',1,'std::unordered_map::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a72250fbcb87cc6ea4998eb8f00465650',1,'std::unordered_multimap::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#afea08a0d2315df4b6da1318c74be7114',1,'std::unordered_multimap::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a1d6af6a14a53c2709b072d6722ecf039',1,'std::unordered_multiset::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#aff0cd0917d69025d995dd401c1ec63a6',1,'std::unordered_multiset::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ac182f2597af135950bfc3b1cd09575ec',1,'std::unordered_set::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a086929d624211470ff2b20a0ba23a86d',1,'std::unordered_set::max_load_factor(float __z)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#ae2f58d908f2e03656fce158550d9ba73',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_load_factor() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a0584274b6378b6d962debbe96f5c5cb6',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_load_factor(float __z)']]], + ['max_5fsize_125',['max_size',['https://docs.opencv.org/4.2.0/d3/d3f/classcv_1_1Allocator.html#a5fdf0b0b785ed6eb4868aa5d587ead96',1,'cv::Allocator::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a29c306bcb6a7676a516430a0e50b990a',1,'__alloc_traits< _Tp_alloc_type >::max_size(const _Tp_alloc_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'__alloc_traits< _Tp_alloc_type >::max_size(const _Tp_alloc_type &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a10239.html#a29c306bcb6a7676a516430a0e50b990a',1,'__gnu_cxx::__alloc_traits::max_size(const _Alloc &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'__gnu_cxx::__alloc_traits::max_size(const _Alloc &__a) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac8315ed08ac178584cf4a80ff4f7346a',1,'__gnu_cxx::__versa_string::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'__gnu_debug::basic_string::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'allocator_traits< _Tp_alloc_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< _CharT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< _CharT, _Traits, _Allocator >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< char >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< char, char_traits< char >, _Byte_alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< char_type, _Traits, _Alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'basic_string< value_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5aea8252ed76805923d591f878768f67',1,'deque< _StateSeqT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac0642b1d26b07dcf28d5fd72bfbdd6d1',1,'list< __inp, __rebind_inp >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a586a8264c3ff903b6a2d66b245c3f88e',1,'match_results< _Bi_iter >::max_size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a586a8264c3ff903b6a2d66b245c3f88e',1,'match_results< _Bi_iter >::max_size() const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04687.html#a29c306bcb6a7676a516430a0e50b990a',1,'std::allocator_traits::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04719.html#a7d06983d84598768a8aa6458ac10738c',1,'std::allocator_traits< allocator< _Tp > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae64648328b956cc014db981cfd763df4',1,'std::basic_string::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a5aea8252ed76805923d591f878768f67',1,'std::deque::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#ae19c74808b1bc8e53bdc229fd3d389fa',1,'std::forward_list::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#ac0642b1d26b07dcf28d5fd72bfbdd6d1',1,'std::list::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#af2c022c3b246d7beb4c6eae4d6ce7ca2',1,'std::map::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a586a8264c3ff903b6a2d66b245c3f88e',1,'std::match_results::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a6c9a48e59ffb98b5afe9003861f1ddee',1,'std::multimap::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aec68936b69a9391df7ea268a7c44fb13',1,'std::multiset::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a84c5ddf1dff1dbdb8583cfabe3605b86',1,'std::set::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a70757335be624593a6bdf3c84d4895ee',1,'std::tr2::dynamic_bitset::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a695e48bcb2fa9e91ad07d3f7c45016dd',1,'std::unordered_map::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#accd0a24f61c8161dbd0fe216ead19142',1,'std::unordered_multimap::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#af0cbbd14540e7875dd507533a959bf77',1,'std::unordered_multiset::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#afbad50ec9cd24208c2b33f35aa50f371',1,'std::unordered_set::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'std::vector::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a695e48bcb2fa9e91ad07d3f7c45016dd',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< __diff_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _CharClassT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _CharT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _Cmpt >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _Node *, _Nodeptr_Alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _RealType >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _State< _TraitsT::char_type > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< _StringT >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< block_type, allocator_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< Catalog_info * >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< double >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< int >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< result_type >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< size_t >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< std::pair< _BiIter, int > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< std::pair< _StateIdT, std::vector > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< std::pair< _StrTransT, _StrTransT > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< sub_match< _Bi_iter >, _Alloc >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::max_size()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a7abf19c35e087a2d4596f651e340fb89',1,'vector< sub_match< _BiIter >, _Alloc >::max_size()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a1b46c6631e30b8394e89bd1546d69736.html#a1b46c6631e30b8394e89bd1546d69736',1,'nlohmann::basic_json::max_size()']]], + ['maxclockfrequency_126',['maxClockFrequency',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a2ad4a9905df7939ff4dbe1e1323155ef',1,'cv::ocl::Device']]], + ['maxcoeff_127',['maxCoeff',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'Eigen::DenseBase::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'Eigen::DenseBase::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'Eigen::DenseBase::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'DenseBase< ArrayWrapper< ExpressionType > >::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'DenseBase< ArrayWrapper< ExpressionType > >::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'DenseBase< ArrayWrapper< ExpressionType > >::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a7e6987d106f1cca3ac6ab36d288cc8e1',1,'DenseBase< Solve< Decomposition, RhsType > >::maxCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aced8ffda52ff061b6586ace2657ebf30',1,'DenseBase< Solve< Decomposition, RhsType > >::maxCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3780b7a9cd184d0b4f3ea797eba9e2b3',1,'DenseBase< Solve< Decomposition, RhsType > >::maxCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'Eigen::VectorwiseOp::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Derived, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Derived, Vertical >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::maxCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6646b584db116c1661b5bb56750bd6f6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::maxCoeff()']]], + ['maxcomputeunits_128',['maxComputeUnits',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a8cdbedf915935b8a3de00abcf0ff9669',1,'cv::ocl::Device']]], + ['maxconstantargs_129',['maxConstantArgs',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a1ab0e68f5c0ab2daa578f0b408f71353',1,'cv::ocl::Device']]], + ['maxconstantbuffersize_130',['maxConstantBufferSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#aa5ce4c19f0b23e5cad7ad9e55aef2e0c',1,'cv::ocl::Device']]], + ['maxgridsize_131',['maxGridSize',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a0a1d357f595900f4ecdac350db7d672c',1,'cv::cuda::DeviceInfo']]], + ['maxiterations_132',['maxIterations',['https://eigen.tuxfamily.org/dox/classEigen_1_1IterativeSolverBase.html#a168a74c8dceb6233b220031fdd756ba0',1,'Eigen::IterativeSolverBase']]], + ['maxlevel_133',['maxLevel',['https://docs.opencv.org/4.2.0/d2/d86/classcv_1_1videostab_1_1PyrLkOptFlowEstimatorBase.html#aa1e49ada8bd3ff9eb22811a48ca3dc90',1,'cv::videostab::PyrLkOptFlowEstimatorBase']]], + ['maxmemallocsize_134',['maxMemAllocSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a43a7ce355911b326d286ecaab3fb2e30',1,'cv::ocl::Device']]], + ['maxparametersize_135',['maxParameterSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a0878eb6f7c3b8d9043e46d73a00137f3',1,'cv::ocl::Device']]], + ['maxpivot_136',['maxPivot',['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aac8c43d720170980f582d01494df9e8f',1,'Eigen::ColPivHouseholderQR::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ColPivHouseholderQR.html#aac8c43d720170980f582d01494df9e8f',1,'ColPivHouseholderQR< MatrixType >::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1CompleteOrthogonalDecomposition.html#a5b712a58c13b7e5089be9228ec42f738',1,'Eigen::CompleteOrthogonalDecomposition::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivHouseholderQR.html#a7887506237a3bf912aebc9aaa8edacec',1,'Eigen::FullPivHouseholderQR::maxPivot()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1FullPivLU.html#abced9f280f5fc49c2e62605c782b237b',1,'Eigen::FullPivLU::maxPivot()']]], + ['maxreadimageargs_137',['maxReadImageArgs',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a5b3698f3adbd38f41531799ae54e1826',1,'cv::ocl::Device']]], + ['maxsamplers_138',['maxSamplers',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a88f1375b142fbed9b3fcf69ffd70289c',1,'cv::ocl::Device']]], + ['maxsize_139',['maxSize',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#abed50a3b4fb6efb9a9a05b7c55c0edc2',1,'INCVMemAllocator::maxSize()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#a312414baa9360f6a2928e5b8a4570e56',1,'NCVMemNativeAllocator::maxSize()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#a492aadf40fab71f92b24f679e9f6a677',1,'NCVMemStackAllocator::maxSize()']]], + ['maxsurface1d_140',['maxSurface1D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a260dccdd9395ca059b60d2c250a7b19d',1,'cv::cuda::DeviceInfo']]], + ['maxsurface1dlayered_141',['maxSurface1DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a2c6c2d86c79673e0f003f72999901e0b',1,'cv::cuda::DeviceInfo']]], + ['maxsurface2d_142',['maxSurface2D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a5c46713e52796df8de5cc0675545b591',1,'cv::cuda::DeviceInfo']]], + ['maxsurface2dlayered_143',['maxSurface2DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ab382770adf2533cf52a6ec8dfdeceefd',1,'cv::cuda::DeviceInfo']]], + ['maxsurface3d_144',['maxSurface3D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#add5a8209f3a0a244bca9ce602a3ca8b9',1,'cv::cuda::DeviceInfo']]], + ['maxsurfacecubemap_145',['maxSurfaceCubemap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a380277029eb0760f3cdd599fdd6d6a68',1,'cv::cuda::DeviceInfo']]], + ['maxsurfacecubemaplayered_146',['maxSurfaceCubemapLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a6d2514b8ea311750d6640cb0a09ee885',1,'cv::cuda::DeviceInfo']]], + ['maxtexture1d_147',['maxTexture1D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a7dadb9baaef83deb18a19340eff89efd',1,'cv::cuda::DeviceInfo']]], + ['maxtexture1dlayered_148',['maxTexture1DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a63595aa52127a5e101aa2bd05bf21213',1,'cv::cuda::DeviceInfo']]], + ['maxtexture1dlinear_149',['maxTexture1DLinear',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a6ca6a1f3ccffbe4bcd082bb051a84709',1,'cv::cuda::DeviceInfo']]], + ['maxtexture1dmipmap_150',['maxTexture1DMipmap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8400034f3a46ec994d5f0b2b3097994d',1,'cv::cuda::DeviceInfo']]], + ['maxtexture2d_151',['maxTexture2D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a99a188ab0931a15cd512a75e7fa448b5',1,'cv::cuda::DeviceInfo']]], + ['maxtexture2dgather_152',['maxTexture2DGather',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a91932040e2174937d7db801dc51e37e1',1,'cv::cuda::DeviceInfo']]], + ['maxtexture2dlayered_153',['maxTexture2DLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a868a27580ea696306c83aa5da2fea496',1,'cv::cuda::DeviceInfo']]], + ['maxtexture2dlinear_154',['maxTexture2DLinear',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#afe9b3a92a9832c6a8f52f8a006b8f297',1,'cv::cuda::DeviceInfo']]], + ['maxtexture2dmipmap_155',['maxTexture2DMipmap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#abd1a87ff21e6ace392634e05403618b6',1,'cv::cuda::DeviceInfo']]], + ['maxtexture3d_156',['maxTexture3D',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#aed437fa43c5294c1fbb3f909a535ca57',1,'cv::cuda::DeviceInfo']]], + ['maxtexturecubemap_157',['maxTextureCubemap',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ab66a0f8545b5f2b0104c56fe1373451c',1,'cv::cuda::DeviceInfo']]], + ['maxtexturecubemaplayered_158',['maxTextureCubemapLayered',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a7fa8dda4989ff180a91d2d55377eab56',1,'cv::cuda::DeviceInfo']]], + ['maxthreadsdim_159',['maxThreadsDim',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#acd6c9806faa5718ac6ce46cf7f94b1b0',1,'cv::cuda::DeviceInfo']]], + ['maxthreadsperblock_160',['maxThreadsPerBlock',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ac90a47955f85b4b9b082f6f211562aa9',1,'cv::cuda::DeviceInfo']]], + ['maxthreadspermultiprocessor_161',['maxThreadsPerMultiProcessor',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8f827f2c363f19c7167479793f246bfa',1,'cv::cuda::DeviceInfo']]], + ['maxval_5f_162',['maxVal_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84304ffdf1361fe076ec78d18d9b9e49',1,'cv::cudev::maxVal_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84304ffdf1361fe076ec78d18d9b9e49',1,'maxVal_()(Global Namespace)']]], + ['maxworkgroupsize_163',['maxWorkGroupSize',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#afd60a223663d5b4951d585e9f167d54f',1,'cv::ocl::Device']]], + ['maxworkitemdims_164',['maxWorkItemDims',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a6c76e7f57a273ea51e3564a4f1269158',1,'cv::ocl::Device']]], + ['maxworkitemsizes_165',['maxWorkItemSizes',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a693878609398a5edafad71026661e41f',1,'cv::ocl::Device']]], + ['maxwriteimageargs_166',['maxWriteImageArgs',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#afc62c78591b741fdca19a729867686ca',1,'cv::ocl::Device']]], + ['mctkernel_167',['MCTKernel',['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a377cbc392538c3039bec7de2bb08f9cd',1,'cv::stereo::MCTKernel::MCTKernel()'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a84d81c259c0c425e804e8ecfa58e9970',1,'cv::stereo::MCTKernel::MCTKernel(uint8_t **images, int threshold)']]], + ['mean_168',['mean',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abcc6e9b8ff25f5d1e076cb5f51f42231',1,'normal_distribution< double >::mean()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abcc6e9b8ff25f5d1e076cb5f51f42231',1,'normal_distribution< result_type >::mean()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#abcc6e9b8ff25f5d1e076cb5f51f42231',1,'std::normal_distribution::mean()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a92604e5687496c6efcc7148840fb478c',1,'std::poisson_distribution::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'Eigen::DenseBase::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'DenseBase< ArrayWrapper< ExpressionType > >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a21ac6c0419a72ad7a88ea0bc189017d7',1,'DenseBase< Solve< Decomposition, RhsType > >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'Eigen::VectorwiseOp::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Derived, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Derived, Vertical >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::mean()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aaf7d867f9e6b74a1bc7f108d646cfa85',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::mean()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga191389f8a0e58180bb13a727782cd461',1,'cv::mean()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa37ea1b811bcc3e26ee1b3fb00acc55c',1,'cv::gapi::mean()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga191389f8a0e58180bb13a727782cd461',1,'mean(InputArray src, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa37ea1b811bcc3e26ee1b3fb00acc55c',1,'mean(const GMat &src)(Global Namespace)']]], + ['meanandvariancealongrows_169',['meanAndVarianceAlongRows',['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga10bf67ff702c28406312748f905863ec',1,'cv::sfm::meanAndVarianceAlongRows()'],['https://docs.opencv.org/4.2.0/d1/d6a/group__numeric.html#ga10bf67ff702c28406312748f905863ec',1,'meanAndVarianceAlongRows()(Global Namespace)']]], + ['meankernelintegralimage_170',['MeanKernelIntegralImage',['https://docs.opencv.org/4.2.0/de/d9b/classcv_1_1stereo_1_1MeanKernelIntegralImage.html#a4a35ad65bd56ee5110cde92a40bb6ca7',1,'cv::stereo::MeanKernelIntegralImage']]], + ['meanshift_171',['meanShift',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga432a563c94eaf179533ff1e83dbb65ea',1,'cv::meanShift()'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#ga432a563c94eaf179533ff1e83dbb65ea',1,'meanShift()(Global Namespace)']]], + ['meanshiftfiltering_172',['meanShiftFiltering',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gae13b3035bc6df0e512d876dbb8c00555',1,'cv::cuda::meanShiftFiltering()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#gae13b3035bc6df0e512d876dbb8c00555',1,'meanShiftFiltering()(Global Namespace)']]], + ['meanshiftproc_173',['meanShiftProc',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga6039dc8ecbe2f912bc83fcc9b3bcca39',1,'cv::cuda::meanShiftProc()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga6039dc8ecbe2f912bc83fcc9b3bcca39',1,'meanShiftProc()(Global Namespace)']]], + ['meanshiftsegmentation_174',['meanShiftSegmentation',['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga70ed80533a448829dc48cf22b1845c16',1,'cv::cuda::meanShiftSegmentation()'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html#ga70ed80533a448829dc48cf22b1845c16',1,'meanShiftSegmentation()(Global Namespace)']]], + ['meanstddev_175',['meanStdDev',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga846c858f4004d59493d7c6a4354b301d',1,'cv::meanStdDev()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga990a4db4c6d7e8f0f3a6685ba48fbddc',1,'cv::cuda::meanStdDev(InputArray mtx, Scalar &mean, Scalar &stddev)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac0e8dc0bb32fda5afd32de0f18817587',1,'cv::cuda::meanStdDev(InputArray mtx, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga846c858f4004d59493d7c6a4354b301d',1,'meanStdDev(InputArray src, OutputArray mean, OutputArray stddev, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga990a4db4c6d7e8f0f3a6685ba48fbddc',1,'meanStdDev(InputArray mtx, Scalar &mean, Scalar &stddev)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#gac0e8dc0bb32fda5afd32de0f18817587',1,'meanStdDev(InputArray mtx, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)']]], + ['measurementfunction_176',['measurementFunction',['https://docs.opencv.org/4.2.0/da/d2b/classcv_1_1tracking_1_1UkfSystemModel.html#ae8f272725272a23cc45dee75fb65349d',1,'cv::tracking::UkfSystemModel']]], + ['median1x9filter_177',['Median1x9Filter',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#a4bdb66993689eb64dcb63f8b81c6046c',1,'cv::stereo::Matching']]], + ['median9x1filter_178',['Median9x1Filter',['https://docs.opencv.org/4.2.0/d1/d62/classcv_1_1stereo_1_1Matching.html#ac2a8d29abd0681427dbaac6819e88b11',1,'cv::stereo::Matching']]], + ['medianblur_179',['medianBlur',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga564869aa33e58769b4469101aac458f9',1,'cv::medianBlur()'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga90c28c4986e8117ecb1b61300ff3e7e8',1,'cv::gapi::medianBlur()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga564869aa33e58769b4469101aac458f9',1,'medianBlur(InputArray src, OutputArray dst, int ksize)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html#ga90c28c4986e8117ecb1b61300ff3e7e8',1,'medianBlur(const GMat &src, int ksize)(Global Namespace)']]], + ['mem_5ffn_180',['mem_fn',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html#gadd917dd05154842bc6aebcf5c90abb7f',1,'std::mem_fn()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html#gadd917dd05154842bc6aebcf5c90abb7f',1,'mem_fn()(Global Namespace)']]], + ['membaseaddralign_181',['memBaseAddrAlign',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ad13666f3a1309fd46afddeee390049d1',1,'cv::ocl::Device']]], + ['memoptypetostr_182',['memopTypeToStr',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga3a8b3c8a8991e15ac4e4aa2a007bb2ea',1,'cv::ocl::memopTypeToStr()'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html#ga3a8b3c8a8991e15ac4e4aa2a007bb2ea',1,'memopTypeToStr()(Global Namespace)']]], + ['memorybuswidth_183',['memoryBusWidth',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#adc029e9b7100063a9646a50435f55ed3',1,'cv::cuda::DeviceInfo']]], + ['memoryclockrate_184',['memoryClockRate',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a014f96fb7cd5639480347e7de85686be',1,'cv::cuda::DeviceInfo']]], + ['mempitch_185',['memPitch',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#ac9923f30632f9a587a0d5f971fdfaf62',1,'cv::cuda::DeviceInfo']]], + ['memsegcopyhelper_186',['memSegCopyHelper',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga75faff2ec1d14c63918ee02e74e988cc',1,]]], + ['memsegcopyhelper2d_187',['memSegCopyHelper2D',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ga253a695ab7a336ebb07008593565cd4c',1,]]], + ['memtype_188',['memType',['https://docs.opencv.org/4.2.0/da/df8/classINCVMemAllocator.html#af8070dc8c7faee07938281306cacf0c8',1,'INCVMemAllocator::memType()'],['https://docs.opencv.org/4.2.0/de/d26/classNCVMatrix.html#a11fb3dc94bd7225421630e4491e226bb',1,'NCVMatrix::memType()'],['https://docs.opencv.org/4.2.0/dc/d18/classNCVMemNativeAllocator.html#af82dd02192ab82e59eb264a8c0aee539',1,'NCVMemNativeAllocator::memType()'],['https://docs.opencv.org/4.2.0/db/d74/classNCVMemStackAllocator.html#ae28f33a2fb00ad0f9e0ed4ba7d48bc34',1,'NCVMemStackAllocator::memType()'],['https://docs.opencv.org/4.2.0/dc/d73/classNCVVector.html#a6b686f2701af81ddd34aa121246bca01',1,'NCVVector::memType()']]], + ['mercatorwarper_189',['MercatorWarper',['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1detail_1_1MercatorWarper.html#a3db79c1c7a45176cd58da433556769c9',1,'cv::detail::MercatorWarper']]], + ['merge_190',['merge',['https://docs.opencv.org/4.2.0/dc/d7a/classcv_1_1ximgproc_1_1segmentation_1_1SelectiveSearchSegmentationStrategy.html#a161d214c83db7e0dc0812dabed6674fb',1,'cv::ximgproc::segmentation::SelectiveSearchSegmentationStrategy::merge()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4d6a44991e6e9a4f1d74236e7d6fc012',1,'list< __inp, __rebind_inp >::merge(list &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a44306154a6f093d8168eff45b90aa3ad',1,'list< __inp, __rebind_inp >::merge(list &&__x, _StrictWeakOrdering __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a4794e46af448c443019e9b36640744ab',1,'std::forward_list::merge(forward_list &&__list)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a0de7b075b73cc0a843447ad75cba4b87',1,'std::forward_list::merge(forward_list &&__list, _Comp __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a4d6a44991e6e9a4f1d74236e7d6fc012',1,'std::list::merge(list &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a44306154a6f093d8168eff45b90aa3ad',1,'std::list::merge(list &&__x, _StrictWeakOrdering __comp)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7d7b4d6c6ee504b30a20b1680029c7b4',1,'cv::merge(const Mat *mv, size_t count, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga61f2f2bde4a0a0154b2333ea504fab1d',1,'cv::merge(InputArrayOfArrays mv, OutputArray dst)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaac939dc3b178ee92fb6e7078f342622c',1,'cv::cuda::merge(const GpuMat *src, size_t n, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gafce19eb0fcad23f67ab45d544992436d',1,'cv::cuda::merge(const std::vector< GpuMat > &src, OutputArray dst, Stream &stream=Stream::Null())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7d7b4d6c6ee504b30a20b1680029c7b4',1,'merge(const Mat *mv, size_t count, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga61f2f2bde4a0a0154b2333ea504fab1d',1,'merge(InputArrayOfArrays mv, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gaac939dc3b178ee92fb6e7078f342622c',1,'merge(const GpuMat *src, size_t n, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html#gafce19eb0fcad23f67ab45d544992436d',1,'merge(const std::vector< GpuMat > &src, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabb18bc670a27e539246a2eb154f60351',1,'std::merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7f7771648d074e296d019153633efa8d',1,'std::merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabb18bc670a27e539246a2eb154f60351',1,'merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga7f7771648d074e296d019153633efa8d',1,'merge(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _OutputIterator __result, _Compare __comp)(Global Namespace)']]], + ['merge16u_191',['merge16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf3380647212f442cdc89ada0d26e5dd1',1,'cv::hal::merge16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf3380647212f442cdc89ada0d26e5dd1',1,'merge16u()(Global Namespace)']]], + ['merge3_192',['merge3',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaf63e894270a088695e6ec97d9a903971',1,'cv::gapi::merge3()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#gaf63e894270a088695e6ec97d9a903971',1,'merge3()(Global Namespace)']]], + ['merge32s_193',['merge32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6d608cfae074f0f75db7e7f4e760be0f',1,'cv::hal::merge32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6d608cfae074f0f75db7e7f4e760be0f',1,'merge32s()(Global Namespace)']]], + ['merge4_194',['merge4',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga8206d42b933edcbf08d6953e202d0dd0',1,'cv::gapi::merge4()'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html#ga8206d42b933edcbf08d6953e202d0dd0',1,'merge4()(Global Namespace)']]], + ['merge64s_195',['merge64s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5e717dd8d0a41c6c06793ab9308c8fc6',1,'cv::hal::merge64s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5e717dd8d0a41c6c06793ab9308c8fc6',1,'merge64s()(Global Namespace)']]], + ['merge8u_196',['merge8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6b834e84af204ef9becc0805dca5caab',1,'cv::hal::merge8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga6b834e84af204ef9becc0805dca5caab',1,'merge8u()(Global Namespace)']]], + ['merge_5fpatch_197',['merge_patch',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a844a77cb154752d12118f10af26d54cb.html#a844a77cb154752d12118f10af26d54cb',1,'nlohmann::basic_json']]], + ['merged_198',['merged',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#a59eb62d949598853fbc83836e8f2960c',1,'Eigen::AlignedBox']]], + ['mergesets_199',['mergeSets',['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1detail_1_1DisjointSets.html#ace5164c3b1500421c96c7b6cc4dfaa9d',1,'cv::detail::DisjointSets']]], + ['mersenne_5ftwister_5fengine_200',['mersenne_twister_engine',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8987d5bb70c31ba8e4bb80f993acff85',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::mersenne_twister_engine()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#a8987d5bb70c31ba8e4bb80f993acff85',1,'std::mersenne_twister_engine::mersenne_twister_engine()']]], + ['messages_201',['messages',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a71483d79d47eaf8f3739c4b6b971b00e',1,'std::messages::messages(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#a8cfe4d6b3be654727ca4f705c27b3d51',1,'std::messages::messages(__c_locale __cloc, const char *__s, size_t __refs=0)']]], + ['meta_202',['meta',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#acd5da358f7568c97824b029596f92b11',1,'cv::gapi::fluid::Buffer::meta()'],['https://docs.opencv.org/4.2.0/d2/da0/classcv_1_1gapi_1_1fluid_1_1View.html#a0b7410b59963f6fb33bdc2a45c518960',1,'cv::gapi::fluid::View::meta()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a351b4f65014f6c2b8b2832847d44bbd7.html#a351b4f65014f6c2b8b2832847d44bbd7',1,'nlohmann::basic_json::meta()']]], + ['metas_203',['metas',['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ae105107abedd589e94153a0e6f916367',1,'cv::GCompiled::metas()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#a027d4aa5e0fef550fe7389984482b3a5',1,'cv::GStreamingCompiled::metas()']]], + ['meterstogps_204',['metersToGPS',['../classGPSToMetersConverter.html#a434ba240ca25217c058cfa2b3f58b68d',1,'GPSToMetersConverter']]], + ['min_205',['min',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac22d7d32f1ec91fd106760a98a6f4731',1,'cv::MatExpr::min(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aafbfd6a44196ca5f40bcea5136548c22',1,'cv::MatExpr::min(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a865832a7380156566594f039d4ff0ff6',1,'cv::MatExpr::min(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6fdbec4b3fdb2b23f1d79bc73640d371',1,'cv::MatExpr::min(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a176d14d2ffed87f4e024d4933104a2bb',1,'cv::MatExpr::min(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac22d7d32f1ec91fd106760a98a6f4731',1,'cv::MatExpr::min(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aafbfd6a44196ca5f40bcea5136548c22',1,'cv::MatExpr::min(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a865832a7380156566594f039d4ff0ff6',1,'cv::MatExpr::min(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6fdbec4b3fdb2b23f1d79bc73640d371',1,'cv::MatExpr::min(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a176d14d2ffed87f4e024d4933104a2bb',1,'cv::MatExpr::min(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/da/d81/structcv_1_1cudev_1_1numeric__limits_3_01bool_01_4.html#a359fab492885fe351389d0f3b99e304a',1,'cv::cudev::numeric_limits< bool >::min()'],['https://docs.opencv.org/4.2.0/d2/d80/structcv_1_1cudev_1_1numeric__limits_3_01double_01_4.html#a079f77010993f609c5834184a3fc571e',1,'cv::cudev::numeric_limits< double >::min()'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1cudev_1_1numeric__limits_3_01float_01_4.html#aea8ce5e57cd0c36d0ca81a523e0640a1',1,'cv::cudev::numeric_limits< float >::min()'],['https://docs.opencv.org/4.2.0/da/d4e/structcv_1_1cudev_1_1numeric__limits_3_01schar_01_4.html#a22dd9ab6b9d4491a33a70c432e868187',1,'cv::cudev::numeric_limits< schar >::min()'],['https://docs.opencv.org/4.2.0/d1/d8b/structcv_1_1cudev_1_1numeric__limits_3_01short_01_4.html#a63563af1d24632a4b6d62cc168d54a06',1,'cv::cudev::numeric_limits< short >::min()'],['https://docs.opencv.org/4.2.0/d3/dc7/structcv_1_1cudev_1_1numeric__limits_3_01uchar_01_4.html#aac19eaa31ded65f911830b3f45e4e5ba',1,'cv::cudev::numeric_limits< uchar >::min()'],['https://docs.opencv.org/4.2.0/dd/d89/structcv_1_1cudev_1_1numeric__limits_3_01uint_01_4.html#ab9f226ae2e962a64a9ba9d89e1ecf288',1,'cv::cudev::numeric_limits< uint >::min()'],['https://docs.opencv.org/4.2.0/df/d47/structcv_1_1cudev_1_1numeric__limits_3_01ushort_01_4.html#a541b9509bbd6782ccf98bf2abc68380b',1,'cv::cudev::numeric_limits< ushort >::min()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9a426dcd6be0bd77995b636fe291e6d0',1,'cv::softdouble::min()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga2473116e9ce9a101a7e6ed53753df9b6',1,'cv::softfloat::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a7dc4b8a5f0edcf447683b93607a8441e',1,'gamma_distribution< double >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a7dc4b8a5f0edcf447683b93607a8441e',1,'gamma_distribution< result_type >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#aaf1720ef1664fa77a5972c78addfa290',1,'mersenne_twister_engine< uint_fast32_t, 32, 624, 397, 31, 0x9908b0dfUL, 11, 0xffffffffUL, 7, 0x9d2c5680UL, 15, 0xefc60000UL, 18, 1812433253UL >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#aa79e79b65edcb6f45dda08b3efdff9e8',1,'normal_distribution< double >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#aa79e79b65edcb6f45dda08b3efdff9e8',1,'normal_distribution< result_type >::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#acfd63c2f93e6215cd8304db6f5c39df4',1,'std::bernoulli_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a0dcaff746d5993e73b30cbbc70afbd05',1,'std::binomial_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#a93cbd65b4fa6d5a84149a0db63c7e10c',1,'std::cauchy_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a71039379ac60b7df94b625c4a45cb287',1,'std::chi_squared_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#a16286565620fc6966ca53540572ede38',1,'std::discard_block_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a2ea8319bc859527d8a4f22380ab85672',1,'std::discrete_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a21226cd61a367799a695c438f6c0af26',1,'std::exponential_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#aa97af0bfaca27148976ef1a65ab257c5',1,'std::extreme_value_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#a7b129ca3a6af6d6d063ecde317361ef8',1,'std::fisher_f_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a7dc4b8a5f0edcf447683b93607a8441e',1,'std::gamma_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#af711039331910d5b184bfcdb43e4e12b',1,'std::geometric_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a5900ce9b2214d848cce14cb82ce71397',1,'std::independent_bits_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#a57c283a281f9b007e0a7659b57586f52',1,'std::linear_congruential_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#aa6d60ac02923738e93e5cc2813d9cfea',1,'std::lognormal_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06335.html#aaf1720ef1664fa77a5972c78addfa290',1,'std::mersenne_twister_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#ab4c3074bd3f87187e7de81a5ece8522c',1,'std::negative_binomial_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#aa79e79b65edcb6f45dda08b3efdff9e8',1,'std::normal_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02519.html#aae25581f91ebab83161d2da3fe0cdb9d',1,'std::numeric_limits::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a1d4e28300518616fef3f4b93a3d1d10d',1,'std::piecewise_constant_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#adaf7520277cc879942d011de156dc184',1,'std::piecewise_linear_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#afb49039795f3c63e256f6b4d2cfab433',1,'std::poisson_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#a113fdc5d67d45435e869a9e905a3c658',1,'std::shuffle_order_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a40bd6b63baec90b927fc13bb5d3b2bba',1,'std::student_t_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a945725b8377db61951fc9c79a0f9aac1',1,'std::subtract_with_carry_engine::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a6e74f2a2cb1d736ac814efd4691f7fe0',1,'std::uniform_int_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#a7e6fbfe7a4278ebf8a85cb9b4afa6ec2',1,'std::uniform_real_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41cf9f2fac24470499589628f657be67',1,'std::valarray::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a3060d7ec6a83eb719429f3a0677705ff',1,'std::weibull_distribution::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41cf9f2fac24470499589628f657be67',1,'valarray< size_t >::min()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#adad123f7e84a2437806a791b96af04bd',1,'Eigen::AlignedBox::min()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#af7fddcf06b60392f3f21b4d8e0f763a0',1,'Eigen::AlignedBox::min() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac48df53b8fd34b87e7b121fa8fd4c379',1,'cv::min(const softfloat &a, const softfloat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf625702f70e571f33784b0652be9a7b7',1,'cv::min(const softdouble &a, const softdouble &b)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9af368f182ee76d0463d0d8d5330b764',1,'cv::min(InputArray src1, InputArray src2, OutputArray dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0b8852cd1a92366860e390e8abbe78dc',1,'cv::min(const Mat &src1, const Mat &src2, Mat &dst)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa83bf3dce9a4a488675347fff6692cb9',1,'cv::min(const UMat &src1, const UMat &src2, UMat &dst)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga74f0b05a65b3d949c237abb5e6c60867',1,'cv::cuda::min()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166301154ec0c6fb8859c8126e013fac',1,'cv::cudev::min(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37cfadd8b02bc1989b2ff264d915a6b',1,'cv::cudev::min(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e7580e80893052d84dfb5ec5ca5f766',1,'cv::cudev::min(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99931470f4d68820bbc5459ed795da8d',1,'cv::cudev::min(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f515695538396fb8648b71901d058d',1,'cv::cudev::min(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad2901b8dd9a2efa1ea3a075ddf2d3f8',1,'cv::cudev::min(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga580140f65047fb3188cd74f2d0f69a08',1,'cv::cudev::min(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf199b5514de7c6a6af1b2c73c5725b7b',1,'cv::cudev::min(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa618ba2f3832b30d643cce7efa62a04c',1,'cv::cudev::min(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c687dbc301bada436f1b666ac1ad4de',1,'cv::cudev::min(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad638c54878b6ccf16f85915845369fb8',1,'cv::cudev::min(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77ec7dd3c8bf8d93adb1a0ae89226dc0',1,'cv::cudev::min(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68ba59a2fd07a335aa566788ae5b6dd8',1,'cv::cudev::min(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga570aa1a8375e90a96942ba5a9d73a8b9',1,'cv::cudev::min(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c5a8171954561ee7d86bad9a5b69ca',1,'cv::cudev::min(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d89f72aa99839fa446920cee353de8',1,'cv::cudev::min(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad897218ccbbb0e9cc8660213479afad2',1,'cv::cudev::min(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga211f9a750f17f04c671e1ecff782d3b0',1,'cv::cudev::min(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga534ff33d0fb6a9f231c45e11ec109c06',1,'cv::cudev::min(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76547c7e7ce1e38e4bfbc95c41f211a9',1,'cv::cudev::min(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f48115719f2492736e6c1e6e54b47bc',1,'cv::cudev::min(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea84f0591c4aa8110ee233fd83f3b2e7',1,'cv::cudev::min(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29bc62147e04bbc4d5cc713722b3ebc7',1,'cv::cudev::min(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a27832d49d358b841977db8ac614fe',1,'cv::cudev::min(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga874939daee476a502f9e25a60d11a0af',1,'cv::cudev::min(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17b5b845d773a38304e10c6f6ef7a63b',1,'cv::cudev::min(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40ba01d1818bae80a0b25cced8a91b0e',1,'cv::cudev::min(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ea00427d284684a5381f925c8865413',1,'cv::cudev::min(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e3b6cc4c9f631582962e2e8a570974',1,'cv::cudev::min(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cbeba62c9983bec445ede74fe15c5d',1,'cv::cudev::min(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a26ede9e7b8aff8af95843ae065a3d6',1,'cv::cudev::min(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3b5b82737560408526a05e60a01cf0c',1,'cv::cudev::min(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50b5e9c2bd4b51a9ca871a2affbab6be',1,'cv::cudev::min(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bc7c6f847a6b03438d75ad28b20e50',1,'cv::cudev::min(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5700161b6d3d48c4f6b6cb8f6893a77d',1,'cv::cudev::min(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7e88fd0b276bc8f582117afba6f69b8',1,'cv::cudev::min(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ebc299c55f1c956ba1bf59818339a9',1,'cv::cudev::min(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490a5a4ee4b491ca52355d3591963d36',1,'cv::cudev::min(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3deb31d4bd9746fe908aae0a32876a67',1,'cv::cudev::min(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7443e024eba9d6e7dba462db0f87b09',1,'cv::cudev::min(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f584667f590a24d7952bba2c38b9d38',1,'cv::cudev::min(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fa8e7016286ff7a654d7f61c0b229ed',1,'cv::cudev::min(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbdb0b1d874b4d611fbe2fc87aa6723e',1,'cv::cudev::min(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25355dc07c2a9bcfe29dd47ffbd1af1f',1,'cv::cudev::min(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga968ddc4b3f1330fd8bba47996a879279',1,'cv::cudev::min(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00c88b38b31430626b18a806bab64102',1,'cv::cudev::min(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01ef9f5f0c55a33ed31f61b8996a9ef2',1,'cv::cudev::min(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b6e96bf59d8775fe468c8b0f0cd4c59',1,'cv::cudev::min(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053670b49cc762f89cd71a48a23410b2',1,'cv::cudev::min(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ae5c5fe2a9037803d26dc7ac9dc84e6',1,'cv::cudev::min(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebde1cc8ab3c8a2489f018498b4af0e1',1,'cv::cudev::min(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga328aabd669c55a39527628ca404d6d68',1,'cv::cudev::min(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695465274932c09378b6c197485b592e',1,'cv::cudev::min(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga428a2859cdb238bbbbf2fdb9215514bc',1,'cv::cudev::min(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8c71d074f87253f2743bf2d51342f58',1,'cv::cudev::min(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad695d4aa08dad8457dc787eb5b973397',1,'cv::cudev::min(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0500af3d7867bfd51c3cad36ba0a491e',1,'cv::cudev::min(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40714aaf703568f042ac2334279c96be',1,'cv::cudev::min(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79fc45bfa8191d6dacaf6d791c8d657d',1,'cv::cudev::min(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf2fc475cfe7c1829fa659aad92f5311',1,'cv::cudev::min(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3311a28f02b9f7f2322042ba73793dc',1,'cv::cudev::min(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga578896b54a57ff07a3bf7d0c3fd2543f',1,'cv::cudev::min(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc186a6d010c07d69d9f2659f91f172',1,'cv::cudev::min(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c0b1bc40a2ec46f6eb78af0a80253e',1,'cv::cudev::min(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a838e528321de5c93cd881016818f4',1,'cv::cudev::min(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae91887a3df27695bfac7c04a17e7f317',1,'cv::cudev::min(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d81f05a2715d7b4869c831e948241f',1,'cv::cudev::min(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ffc1aaa7e1fbf701e7c705005bbddb',1,'cv::cudev::min(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1dccc25340fb0aaebd5570168f9523f',1,'cv::cudev::min(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6db34e52d79cc78bb82d6473ed9d260b',1,'cv::cudev::min(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d9172e56b98d1e9db062064c8871c2a',1,'cv::cudev::min(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43a5a174cfe82f50b81cae0fef539eb2',1,'cv::cudev::min(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a35bdd7cf565b9ade2b66e59bd0ed',1,'cv::cudev::min(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f2de1cd74a26036c9655cac8f4fd12b',1,'cv::cudev::min(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bbfbc5daa53d92b244b57ea9c7001b3',1,'cv::cudev::min(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c0105c80bfe524779da1b354f6757e6',1,'cv::cudev::min(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga376a6835981117634436f321b2ce2a92',1,'cv::cudev::min(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abd5ca68674510c6de74842959cfdc7',1,'cv::cudev::min(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb06294a2cfbb6069b757839c7fd9da',1,'cv::cudev::min(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ff980b4d39740767b63f1de88d1b57',1,'cv::cudev::min(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7df99230006a5cc5615b0011df7a36',1,'cv::cudev::min(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab249d89f99bb58dd18ca378c735a020',1,'cv::cudev::min(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0253aab8205cbcdfe6214ac2a69fe581',1,'cv::cudev::min(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520bff992e84829c710b2e09546fa22',1,'cv::cudev::min(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f2589513e2749a9851c4124646619b9',1,'cv::cudev::min(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5cbd2b6ca7192b0bd8e8495ef5159b8',1,'cv::cudev::min(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0488483f92053697cbcd087185945cf1',1,'cv::cudev::min(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01bddf9f2a64d5b3e53439be20d9c409',1,'cv::cudev::min(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfea1d9d44ed701c8e800349e04f23ee',1,'cv::cudev::min(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad80ae937fbf7a3dc21a6a6fa8180b099',1,'cv::cudev::min(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72e8042831b9697209fae75abf289835',1,'cv::cudev::min(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff909acfd57096f7c944766d1f65439',1,'cv::cudev::min(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga994dcac74e8ff3a0f53eec9f742c97da',1,'cv::cudev::min(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bf016e8bdbabc4af9fa4e017c17507e',1,'cv::cudev::min(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0e38244f6b1acb8682e3f85143bd492',1,'cv::cudev::min(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabba296ea279127cee978c2e3fb735522',1,'cv::cudev::min(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44e25ba04453413a2aefc32c98efd3d9',1,'cv::cudev::min(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga269a8ed52e0311c9346d987a756dc884',1,'cv::cudev::min(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3fda8022014b87c0102d0bbe0731809',1,'cv::cudev::min(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf44d7528016be23f9f4ef3a7da28bdac',1,'cv::cudev::min(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bcbc2bc3b592e71257b4ee668778787',1,'cv::cudev::min(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b2d8959b9f43f2bc2806dc0ec78a100',1,'cv::cudev::min(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f0ef4c14e25abea43ff8946afeafc8',1,'cv::cudev::min(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca8f4d79b4cc1dec4c909ecf5ccca6a6',1,'cv::cudev::min(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae92efcdaa0c6fab988a414451359851a',1,'cv::cudev::min(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24f7488a901b2674720f7a5126131e64',1,'cv::cudev::min(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11a1d2f321a3eeef5dc50189f5b2ae9e',1,'cv::cudev::min(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39261d4880c70eb9e3ef72458b4ac242',1,'cv::cudev::min(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9eb9db0ca15633cccfddb52a962b6f6f',1,'cv::cudev::min(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e93316cdeb4b820699835dc2c2451cd',1,'cv::cudev::min(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4a86c57c6faaa3c448c0f865a29b26',1,'cv::cudev::min(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3948d81d0bef9933acb0e62becdaebb1',1,'cv::cudev::min(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0eb3c2749a2fc4328bdf119d66c6bc4',1,'cv::cudev::min(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08f676bba98d6a2b2ff33bbb36c458ff',1,'cv::cudev::min(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70b3c38288b779b54682e86ad916fdac',1,'cv::cudev::min(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga165246f51a13bed7eab30ef17dcbc866',1,'cv::cudev::min(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51aaec59cc082c1de9ff5943f582b8a7',1,'cv::cudev::min(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad94786f5db09d1f9ee11cd46a3072e9d',1,'cv::cudev::min(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fbef402308aa4d0431e52e9e59043fc',1,'cv::cudev::min(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bd9efd0d4387ea02188f653b32660ca',1,'cv::cudev::min(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa933f0fd3d30808cb1b00cd3a39143b1',1,'cv::cudev::min(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d51422ef09b9121b7869ad2e5e5343d',1,'cv::cudev::min(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb37e86108df64988afff37c569bf1a',1,'cv::cudev::min(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd636d4ca9bfb329325255cf9471c0b',1,'cv::cudev::min(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4985add7084003b38bae25ce9b5eae2',1,'cv::cudev::min(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc007a2636b9d49e09c17caccca7b41e',1,'cv::cudev::min(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef22b25899d27ffa8f09721d1f5d8b01',1,'cv::cudev::min(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a8db4271fd8c29e4a9c986c8ffa2eb',1,'cv::cudev::min(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0adb3df57e4ce8523b76eb59fe026c1',1,'cv::cudev::min(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99455f76095aede9458911725660297',1,'cv::cudev::min(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06193d22fbddc873a3062371b1854d71',1,'cv::cudev::min(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39835721b56a82de6caea12b5ee0015f',1,'cv::cudev::min(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a9e0cefdaf6cb3661a2319e677167d1',1,'cv::cudev::min(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9376163743f15adf0f696ad00a5e96a2',1,'cv::cudev::min(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga684f17ba826938b730c28b1cf7e16970',1,'cv::cudev::min(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga245743829629cc8a53765790b8ef1433',1,'cv::cudev::min(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae70127cdf2e353258baef57e46ab4189',1,'cv::cudev::min(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf82c6bf26acf9096cd6f8d832e205a9e',1,'cv::cudev::min(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f990e7805334d097290763648fe0d15',1,'cv::cudev::min(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc89effe4a6e1877b214a90c228295fb',1,'cv::cudev::min(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac39cc5c8089033352304fecdb0c23a4a',1,'cv::cudev::min(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga609464e0f3eadb85eb02553bc55c966b',1,'cv::cudev::min(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d1edf16d076507bdeac3810ac34fea1',1,'cv::cudev::min(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6ff0c0ed6a04957c5ebfedd44429fa',1,'cv::cudev::min(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf850e4d7c3c2c5e301a444d81f97b0e9',1,'cv::cudev::min(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28fb416063c7287d74bd18444dbad517',1,'cv::cudev::min(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafac21d2fddb5266c56b94f0cd5060957',1,'cv::cudev::min(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafc4c9e25951034a070b138191a1646a',1,'cv::cudev::min(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a023347bfd7b017630d6396006c919e',1,'cv::cudev::min(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab395407fb935812dd1b2ebbba595861a',1,'cv::cudev::min(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8a6eebe9af1fab17cf91f2aeb54085b',1,'cv::cudev::min(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e644816e75c72b1f5514aa1c9a559f2',1,'cv::cudev::min(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9233bc7f6b5a39cf9b548d268c878a5e',1,'cv::cudev::min(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6b7c35282b6fc4f731ca3c1a7675ed',1,'cv::cudev::min(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e3044507d9d9f6ea035c12e342bf4c4',1,'cv::cudev::min(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga712cbf6a3192826a28b292961344ec8b',1,'cv::cudev::min(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa757af15c28d5ece108f75b9d31303e2',1,'cv::cudev::min(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07de7b9863eb6866b8551688ab0cee91',1,'cv::cudev::min(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1abaccc6127e9ae108f715ea8ca240f',1,'cv::cudev::min(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b09d9c14fe356cdc8fa9e3a11ed35f9',1,'cv::cudev::min(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f99b55e3715d2f70934264240b9ea1a',1,'cv::cudev::min(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd5d53908ea8d992b7176d4f70bf2e1',1,'cv::cudev::min(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad65bb9c77829a24470594a1a06957a1d',1,'cv::cudev::min(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeadc2b477ffa2ba5629c1eeca0b49d63',1,'cv::cudev::min(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41cae75d54fbbd09e25adb26e58458f3',1,'cv::cudev::min(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e5555ef897df48dc04fed27b35a519d',1,'cv::cudev::min(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63987f0c60443f7907a223a23429fa16',1,'cv::cudev::min(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaded7b15e951de4fec9096063ca51bf1b',1,'cv::cudev::min(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae55f0ba96bec14b409e1908032060a01',1,'cv::cudev::min(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71aea75a5c530a382493ca538b9b3018',1,'cv::cudev::min(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451f65567b74e7f92a5d0c1be7090e20',1,'cv::cudev::min(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga003b58a72697803ec951afece96b067c',1,'cv::cudev::min(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga533e7120fae1d8ebc4f464b5ad076ff2',1,'cv::cudev::min(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f8f3331bd8cdfd7d2d0146115910a6c',1,'cv::cudev::min(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b6dea62568edd9aa7cfc0b7ee379b2e',1,'cv::cudev::min(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a607b7403c4299e0c743e50d2f70a0f',1,'cv::cudev::min(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac96713804ac8f9c0be35643a2d6b38a0',1,'cv::cudev::min(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga706808dc4050b903da640de8dc4ce19c',1,'cv::cudev::min(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6d1a1c63011d0b7f43a55e5c867065',1,'cv::cudev::min(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaafdf291e5b12dd034c25a0700e380df',1,'cv::cudev::min(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac052d68d62664c6a829fcfc234b5ad2a',1,'cv::cudev::min(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76f6319d3c3b6aea1d9cfa7e08ec645b',1,'cv::cudev::min(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41aac042716daa83b5cdafd2896cb20e',1,'cv::cudev::min(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga505a34b8ad2b832c446adc4693575ec1',1,'cv::cudev::min(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd2121e8d2a8eb3c442170ce48b30b1',1,'cv::cudev::min(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42f5af056b00eca967153edcf7588cd',1,'cv::cudev::min(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eca6d43aa7825a5757bf5f7effa2c17',1,'cv::cudev::min(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b0dc3a4d4aa6124c3e507986d97dfa',1,'cv::cudev::min(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f1b5f9d9048faafff9fb2d71b48bc66',1,'cv::cudev::min(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74639cd57a08c6e6f002d67251dd6e9',1,'cv::cudev::min(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547a488ab3fd582ac967006d5d41f84b',1,'cv::cudev::min(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae52d65012143641cf97b730ecaf8b384',1,'cv::cudev::min(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5a7dace4270dd3ffb889566f1d4ca7',1,'cv::cudev::min(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bc085902b3894d4369dc5e90e5a7047',1,'cv::cudev::min(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd9203fd6fc69c27d18f0a6dab04cdde',1,'cv::cudev::min(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c6bbe4f5e2d46c15d0276414176ce5a',1,'cv::cudev::min(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e73fe37dc5804eb6fa06a2cb784d929',1,'cv::cudev::min(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d0256b15a322a01a295af1227b210d0',1,'cv::cudev::min(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ec000596d80b26bd3b935fc9f510579',1,'cv::cudev::min(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9b38519d19d3122a8a167758e380ed',1,'cv::cudev::min(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gab714c7a4adc847d75bfc080ac92924f4',1,'cv::gapi::min()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga9af368f182ee76d0463d0d8d5330b764',1,'min(InputArray src1, InputArray src2, OutputArray dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga0b8852cd1a92366860e390e8abbe78dc',1,'min(const Mat &src1, const Mat &src2, Mat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gaa83bf3dce9a4a488675347fff6692cb9',1,'min(const UMat &src1, const UMat &src2, UMat &dst)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga2473116e9ce9a101a7e6ed53753df9b6',1,'min()(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac48df53b8fd34b87e7b121fa8fd4c379',1,'min(const softfloat &a, const softfloat &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf625702f70e571f33784b0652be9a7b7',1,'min(const softdouble &a, const softdouble &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html#gab714c7a4adc847d75bfc080ac92924f4',1,'min(const GMat &src1, const GMat &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga74f0b05a65b3d949c237abb5e6c60867',1,'min(InputArray src1, InputArray src2, OutputArray dst, Stream &stream=Stream::Null())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166301154ec0c6fb8859c8126e013fac',1,'min(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37cfadd8b02bc1989b2ff264d915a6b',1,'min(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e7580e80893052d84dfb5ec5ca5f766',1,'min(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99931470f4d68820bbc5459ed795da8d',1,'min(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f515695538396fb8648b71901d058d',1,'min(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad2901b8dd9a2efa1ea3a075ddf2d3f8',1,'min(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga580140f65047fb3188cd74f2d0f69a08',1,'min(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf199b5514de7c6a6af1b2c73c5725b7b',1,'min(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa618ba2f3832b30d643cce7efa62a04c',1,'min(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c687dbc301bada436f1b666ac1ad4de',1,'min(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad638c54878b6ccf16f85915845369fb8',1,'min(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77ec7dd3c8bf8d93adb1a0ae89226dc0',1,'min(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68ba59a2fd07a335aa566788ae5b6dd8',1,'min(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga570aa1a8375e90a96942ba5a9d73a8b9',1,'min(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c5a8171954561ee7d86bad9a5b69ca',1,'min(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d89f72aa99839fa446920cee353de8',1,'min(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad897218ccbbb0e9cc8660213479afad2',1,'min(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga211f9a750f17f04c671e1ecff782d3b0',1,'min(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga534ff33d0fb6a9f231c45e11ec109c06',1,'min(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76547c7e7ce1e38e4bfbc95c41f211a9',1,'min(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f48115719f2492736e6c1e6e54b47bc',1,'min(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea84f0591c4aa8110ee233fd83f3b2e7',1,'min(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29bc62147e04bbc4d5cc713722b3ebc7',1,'min(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a27832d49d358b841977db8ac614fe',1,'min(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga874939daee476a502f9e25a60d11a0af',1,'min(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17b5b845d773a38304e10c6f6ef7a63b',1,'min(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40ba01d1818bae80a0b25cced8a91b0e',1,'min(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ea00427d284684a5381f925c8865413',1,'min(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3e3b6cc4c9f631582962e2e8a570974',1,'min(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16cbeba62c9983bec445ede74fe15c5d',1,'min(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a26ede9e7b8aff8af95843ae065a3d6',1,'min(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3b5b82737560408526a05e60a01cf0c',1,'min(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50b5e9c2bd4b51a9ca871a2affbab6be',1,'min(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bc7c6f847a6b03438d75ad28b20e50',1,'min(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5700161b6d3d48c4f6b6cb8f6893a77d',1,'min(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7e88fd0b276bc8f582117afba6f69b8',1,'min(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ebc299c55f1c956ba1bf59818339a9',1,'min(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490a5a4ee4b491ca52355d3591963d36',1,'min(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3deb31d4bd9746fe908aae0a32876a67',1,'min(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7443e024eba9d6e7dba462db0f87b09',1,'min(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f584667f590a24d7952bba2c38b9d38',1,'min(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fa8e7016286ff7a654d7f61c0b229ed',1,'min(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbdb0b1d874b4d611fbe2fc87aa6723e',1,'min(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25355dc07c2a9bcfe29dd47ffbd1af1f',1,'min(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga968ddc4b3f1330fd8bba47996a879279',1,'min(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00c88b38b31430626b18a806bab64102',1,'min(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01ef9f5f0c55a33ed31f61b8996a9ef2',1,'min(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b6e96bf59d8775fe468c8b0f0cd4c59',1,'min(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053670b49cc762f89cd71a48a23410b2',1,'min(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ae5c5fe2a9037803d26dc7ac9dc84e6',1,'min(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebde1cc8ab3c8a2489f018498b4af0e1',1,'min(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga328aabd669c55a39527628ca404d6d68',1,'min(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695465274932c09378b6c197485b592e',1,'min(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga428a2859cdb238bbbbf2fdb9215514bc',1,'min(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8c71d074f87253f2743bf2d51342f58',1,'min(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad695d4aa08dad8457dc787eb5b973397',1,'min(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0500af3d7867bfd51c3cad36ba0a491e',1,'min(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40714aaf703568f042ac2334279c96be',1,'min(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79fc45bfa8191d6dacaf6d791c8d657d',1,'min(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf2fc475cfe7c1829fa659aad92f5311',1,'min(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3311a28f02b9f7f2322042ba73793dc',1,'min(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga578896b54a57ff07a3bf7d0c3fd2543f',1,'min(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc186a6d010c07d69d9f2659f91f172',1,'min(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c0b1bc40a2ec46f6eb78af0a80253e',1,'min(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44a838e528321de5c93cd881016818f4',1,'min(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae91887a3df27695bfac7c04a17e7f317',1,'min(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d81f05a2715d7b4869c831e948241f',1,'min(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ffc1aaa7e1fbf701e7c705005bbddb',1,'min(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1dccc25340fb0aaebd5570168f9523f',1,'min(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6db34e52d79cc78bb82d6473ed9d260b',1,'min(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d9172e56b98d1e9db062064c8871c2a',1,'min(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43a5a174cfe82f50b81cae0fef539eb2',1,'min(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a35bdd7cf565b9ade2b66e59bd0ed',1,'min(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f2de1cd74a26036c9655cac8f4fd12b',1,'min(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bbfbc5daa53d92b244b57ea9c7001b3',1,'min(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c0105c80bfe524779da1b354f6757e6',1,'min(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga376a6835981117634436f321b2ce2a92',1,'min(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abd5ca68674510c6de74842959cfdc7',1,'min(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb06294a2cfbb6069b757839c7fd9da',1,'min(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50ff980b4d39740767b63f1de88d1b57',1,'min(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7df99230006a5cc5615b0011df7a36',1,'min(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab249d89f99bb58dd18ca378c735a020',1,'min(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0253aab8205cbcdfe6214ac2a69fe581',1,'min(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520bff992e84829c710b2e09546fa22',1,'min(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f2589513e2749a9851c4124646619b9',1,'min(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5cbd2b6ca7192b0bd8e8495ef5159b8',1,'min(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0488483f92053697cbcd087185945cf1',1,'min(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01bddf9f2a64d5b3e53439be20d9c409',1,'min(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfea1d9d44ed701c8e800349e04f23ee',1,'min(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad80ae937fbf7a3dc21a6a6fa8180b099',1,'min(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72e8042831b9697209fae75abf289835',1,'min(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff909acfd57096f7c944766d1f65439',1,'min(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga994dcac74e8ff3a0f53eec9f742c97da',1,'min(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bf016e8bdbabc4af9fa4e017c17507e',1,'min(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0e38244f6b1acb8682e3f85143bd492',1,'min(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabba296ea279127cee978c2e3fb735522',1,'min(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44e25ba04453413a2aefc32c98efd3d9',1,'min(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga269a8ed52e0311c9346d987a756dc884',1,'min(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3fda8022014b87c0102d0bbe0731809',1,'min(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf44d7528016be23f9f4ef3a7da28bdac',1,'min(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bcbc2bc3b592e71257b4ee668778787',1,'min(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b2d8959b9f43f2bc2806dc0ec78a100',1,'min(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f0ef4c14e25abea43ff8946afeafc8',1,'min(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca8f4d79b4cc1dec4c909ecf5ccca6a6',1,'min(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae92efcdaa0c6fab988a414451359851a',1,'min(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24f7488a901b2674720f7a5126131e64',1,'min(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11a1d2f321a3eeef5dc50189f5b2ae9e',1,'min(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39261d4880c70eb9e3ef72458b4ac242',1,'min(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9eb9db0ca15633cccfddb52a962b6f6f',1,'min(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e93316cdeb4b820699835dc2c2451cd',1,'min(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4a86c57c6faaa3c448c0f865a29b26',1,'min(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3948d81d0bef9933acb0e62becdaebb1',1,'min(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0eb3c2749a2fc4328bdf119d66c6bc4',1,'min(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08f676bba98d6a2b2ff33bbb36c458ff',1,'min(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70b3c38288b779b54682e86ad916fdac',1,'min(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga165246f51a13bed7eab30ef17dcbc866',1,'min(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51aaec59cc082c1de9ff5943f582b8a7',1,'min(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad94786f5db09d1f9ee11cd46a3072e9d',1,'min(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0fbef402308aa4d0431e52e9e59043fc',1,'min(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bd9efd0d4387ea02188f653b32660ca',1,'min(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa933f0fd3d30808cb1b00cd3a39143b1',1,'min(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d51422ef09b9121b7869ad2e5e5343d',1,'min(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fb37e86108df64988afff37c569bf1a',1,'min(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd636d4ca9bfb329325255cf9471c0b',1,'min(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4985add7084003b38bae25ce9b5eae2',1,'min(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc007a2636b9d49e09c17caccca7b41e',1,'min(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef22b25899d27ffa8f09721d1f5d8b01',1,'min(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a8db4271fd8c29e4a9c986c8ffa2eb',1,'min(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0adb3df57e4ce8523b76eb59fe026c1',1,'min(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99455f76095aede9458911725660297',1,'min(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06193d22fbddc873a3062371b1854d71',1,'min(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39835721b56a82de6caea12b5ee0015f',1,'min(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a9e0cefdaf6cb3661a2319e677167d1',1,'min(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9376163743f15adf0f696ad00a5e96a2',1,'min(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga684f17ba826938b730c28b1cf7e16970',1,'min(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga245743829629cc8a53765790b8ef1433',1,'min(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae70127cdf2e353258baef57e46ab4189',1,'min(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf82c6bf26acf9096cd6f8d832e205a9e',1,'min(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f990e7805334d097290763648fe0d15',1,'min(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc89effe4a6e1877b214a90c228295fb',1,'min(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac39cc5c8089033352304fecdb0c23a4a',1,'min(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga609464e0f3eadb85eb02553bc55c966b',1,'min(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d1edf16d076507bdeac3810ac34fea1',1,'min(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6ff0c0ed6a04957c5ebfedd44429fa',1,'min(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf850e4d7c3c2c5e301a444d81f97b0e9',1,'min(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28fb416063c7287d74bd18444dbad517',1,'min(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafac21d2fddb5266c56b94f0cd5060957',1,'min(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafc4c9e25951034a070b138191a1646a',1,'min(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a023347bfd7b017630d6396006c919e',1,'min(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab395407fb935812dd1b2ebbba595861a',1,'min(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8a6eebe9af1fab17cf91f2aeb54085b',1,'min(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e644816e75c72b1f5514aa1c9a559f2',1,'min(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9233bc7f6b5a39cf9b548d268c878a5e',1,'min(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6b7c35282b6fc4f731ca3c1a7675ed',1,'min(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e3044507d9d9f6ea035c12e342bf4c4',1,'min(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga712cbf6a3192826a28b292961344ec8b',1,'min(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa757af15c28d5ece108f75b9d31303e2',1,'min(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07de7b9863eb6866b8551688ab0cee91',1,'min(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1abaccc6127e9ae108f715ea8ca240f',1,'min(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b09d9c14fe356cdc8fa9e3a11ed35f9',1,'min(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f99b55e3715d2f70934264240b9ea1a',1,'min(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd5d53908ea8d992b7176d4f70bf2e1',1,'min(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad65bb9c77829a24470594a1a06957a1d',1,'min(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeadc2b477ffa2ba5629c1eeca0b49d63',1,'min(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41cae75d54fbbd09e25adb26e58458f3',1,'min(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e5555ef897df48dc04fed27b35a519d',1,'min(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63987f0c60443f7907a223a23429fa16',1,'min(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaded7b15e951de4fec9096063ca51bf1b',1,'min(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae55f0ba96bec14b409e1908032060a01',1,'min(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71aea75a5c530a382493ca538b9b3018',1,'min(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451f65567b74e7f92a5d0c1be7090e20',1,'min(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga003b58a72697803ec951afece96b067c',1,'min(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga533e7120fae1d8ebc4f464b5ad076ff2',1,'min(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f8f3331bd8cdfd7d2d0146115910a6c',1,'min(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b6dea62568edd9aa7cfc0b7ee379b2e',1,'min(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a607b7403c4299e0c743e50d2f70a0f',1,'min(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac96713804ac8f9c0be35643a2d6b38a0',1,'min(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga706808dc4050b903da640de8dc4ce19c',1,'min(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6d1a1c63011d0b7f43a55e5c867065',1,'min(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaafdf291e5b12dd034c25a0700e380df',1,'min(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac052d68d62664c6a829fcfc234b5ad2a',1,'min(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76f6319d3c3b6aea1d9cfa7e08ec645b',1,'min(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41aac042716daa83b5cdafd2896cb20e',1,'min(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga505a34b8ad2b832c446adc4693575ec1',1,'min(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd2121e8d2a8eb3c442170ce48b30b1',1,'min(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42f5af056b00eca967153edcf7588cd',1,'min(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eca6d43aa7825a5757bf5f7effa2c17',1,'min(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0b0dc3a4d4aa6124c3e507986d97dfa',1,'min(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f1b5f9d9048faafff9fb2d71b48bc66',1,'min(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74639cd57a08c6e6f002d67251dd6e9',1,'min(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547a488ab3fd582ac967006d5d41f84b',1,'min(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae52d65012143641cf97b730ecaf8b384',1,'min(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5a7dace4270dd3ffb889566f1d4ca7',1,'min(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bc085902b3894d4369dc5e90e5a7047',1,'min(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd9203fd6fc69c27d18f0a6dab04cdde',1,'min(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c6bbe4f5e2d46c15d0276414176ce5a',1,'min(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e73fe37dc5804eb6fa06a2cb784d929',1,'min(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d0256b15a322a01a295af1227b210d0',1,'min(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ec000596d80b26bd3b935fc9f510579',1,'min(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9b38519d19d3122a8a167758e380ed',1,'min(const double3 &a, double s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a694c714713cacc857e126157b5472448',1,'__gnu_parallel::min()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gad48656de2f272a953455e1fff2532125',1,'std::min(const _Tp &__a, const _Tp &__b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6499dc0f7db12560643a3b79db5357f6',1,'std::min(const _Tp &__a, const _Tp &__b, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga41cf9f2fac24470499589628f657be67',1,'min() const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gad48656de2f272a953455e1fff2532125',1,'min(const _Tp &__a, const _Tp &__b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6499dc0f7db12560643a3b79db5357f6',1,'min(const _Tp &__a, const _Tp &__b, _Compare __comp)(Global Namespace)']]], + ['min16s_206',['min16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae83e8c8c49856c8ff27464a5db0d9675',1,'cv::hal::min16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae83e8c8c49856c8ff27464a5db0d9675',1,'min16s()(Global Namespace)']]], + ['min16u_207',['min16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga335e895c38ac1eb36c369be486da8153',1,'cv::hal::min16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga335e895c38ac1eb36c369be486da8153',1,'min16u()(Global Namespace)']]], + ['min32f_208',['min32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf5f3e8331a257006805cc99669177886',1,'cv::hal::min32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gaf5f3e8331a257006805cc99669177886',1,'min32f()(Global Namespace)']]], + ['min32s_209',['min32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5700a944987bea8f8b1d690bef9ddb86',1,'cv::hal::min32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga5700a944987bea8f8b1d690bef9ddb86',1,'min32s()(Global Namespace)']]], + ['min64f_210',['min64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1dfb30bfd99e7ec82e403ac1d2ba564',1,'cv::hal::min64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1dfb30bfd99e7ec82e403ac1d2ba564',1,'min64f()(Global Namespace)']]], + ['min8s_211',['min8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga776e806b44d419b8fe1aeeb0edc33b19',1,'cv::hal::min8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga776e806b44d419b8fe1aeeb0edc33b19',1,'min8s()(Global Namespace)']]], + ['min8u_212',['min8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga728aef20afc83e88001bf555e5375820',1,'cv::hal::min8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga728aef20afc83e88001bf555e5375820',1,'min8u()(Global Namespace)']]], + ['min_5f_213',['min_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03ebd56c9351013f5bb957a585f7137',1,'cv::cudev::min_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03ebd56c9351013f5bb957a585f7137',1,'min_()(Global Namespace)']]], + ['min_5felement_214',['min_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga1de5df2bd9b3d6e5716e82c95ae6df2a',1,'std::min_element(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaef494344047573854d8e2d34070fd2b4',1,'std::min_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga1de5df2bd9b3d6e5716e82c95ae6df2a',1,'min_element(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaef494344047573854d8e2d34070fd2b4',1,'min_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], + ['minarearect_215',['minAreaRect',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga3d476a3417130ae5154aea421ca7ead9',1,'cv::minAreaRect()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga3d476a3417130ae5154aea421ca7ead9',1,'minAreaRect()(Global Namespace)']]], + ['mincoeff_216',['minCoeff',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'Eigen::DenseBase::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'Eigen::DenseBase::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'Eigen::DenseBase::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'DenseBase< ArrayWrapper< ExpressionType > >::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'DenseBase< ArrayWrapper< ExpressionType > >::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'DenseBase< ArrayWrapper< ExpressionType > >::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0739f9c868c331031c7810e21838dcb2',1,'DenseBase< Solve< Decomposition, RhsType > >::minCoeff() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ac9265f4f91430b9cc75d63fb6865bb29',1,'DenseBase< Solve< Decomposition, RhsType > >::minCoeff(IndexType *index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#aa28152ba4a42b2d112e5fec5469ec4c1',1,'DenseBase< Solve< Decomposition, RhsType > >::minCoeff(IndexType *row, IndexType *col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'Eigen::VectorwiseOp::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Derived, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Derived, Vertical >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::minCoeff()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7d7b8c03d180b126fde0ac212e2b0b76',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::minCoeff()']]], + ['minenclosingcircle_217',['minEnclosingCircle',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8ce13c24081bbc7151e9326f412190f1',1,'cv::minEnclosingCircle()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga8ce13c24081bbc7151e9326f412190f1',1,'minEnclosingCircle()(Global Namespace)']]], + ['minenclosingtriangle_218',['minEnclosingTriangle',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga1513e72f6bbdfc370563664f71e0542f',1,'cv::minEnclosingTriangle()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga1513e72f6bbdfc370563664f71e0542f',1,'minEnclosingTriangle()(Global Namespace)']]], + ['minimize_219',['minimize',['https://docs.opencv.org/4.2.0/df/d11/classcv_1_1MinProblemSolver.html#ade85ab8dceca1ee4974f62b758fa90af',1,'cv::MinProblemSolver']]], + ['mininlierratio_220',['minInlierRatio',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#a7601c6c793bbb8337f0de8526339c8af',1,'cv::videostab::MotionEstimatorRansacL2']]], + ['minmax_221',['minMax',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga8d7de68c10717cf25e787e3c20d2dfee',1,'cv::cuda::minMax()'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga8d7de68c10717cf25e787e3c20d2dfee',1,'minMax()(Global Namespace)']]], + ['minmax_222',['minmax',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga67c7bf4c4b3c5cbf251a3812e06e0308',1,'std::minmax(const _Tp &__a, const _Tp &__b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga74c98df71fd53702699434040aacb249',1,'std::minmax(const _Tp &__a, const _Tp &__b, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga67c7bf4c4b3c5cbf251a3812e06e0308',1,'minmax(const _Tp &__a, const _Tp &__b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga74c98df71fd53702699434040aacb249',1,'minmax(const _Tp &__a, const _Tp &__b, _Compare __comp)(Global Namespace)']]], + ['minmax_5felement_223',['minmax_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabaec6cf28af83896d2253693d08d4cfe',1,'std::minmax_element(_ForwardIterator __first, _ForwardIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaa8e6bf20463e0f605a548e7d7efb099d',1,'std::minmax_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gabaec6cf28af83896d2253693d08d4cfe',1,'minmax_element(_ForwardIterator __first, _ForwardIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#gaa8e6bf20463e0f605a548e7d7efb099d',1,'minmax_element(_ForwardIterator __first, _ForwardIterator __last, _Compare __comp)(Global Namespace)']]], + ['minmaxidx_224',['minMaxIdx',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7622c466c628a75d9ed008b42250a73f',1,'cv::minMaxIdx()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga7622c466c628a75d9ed008b42250a73f',1,'minMaxIdx()(Global Namespace)']]], + ['minmaxloc_225',['minMaxLoc',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab473bf2eb6d14ff97e89b355dac20707',1,'cv::minMaxLoc(InputArray src, double *minVal, double *maxVal=0, Point *minLoc=0, Point *maxLoc=0, InputArray mask=noArray())'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8873b86a29c5af51cafdcee82f8150a7',1,'cv::minMaxLoc(const SparseMat &a, double *minVal, double *maxVal, int *minIdx=0, int *maxIdx=0)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga5cacbc2a2323c4eaa81e7390c5d9f530',1,'cv::cuda::minMaxLoc()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gab473bf2eb6d14ff97e89b355dac20707',1,'minMaxLoc(InputArray src, double *minVal, double *maxVal=0, Point *minLoc=0, Point *maxLoc=0, InputArray mask=noArray())(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga8873b86a29c5af51cafdcee82f8150a7',1,'minMaxLoc(const SparseMat &a, double *minVal, double *maxVal, int *minIdx=0, int *maxIdx=0)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html#ga5cacbc2a2323c4eaa81e7390c5d9f530',1,'minMaxLoc(InputArray src, double *minVal, double *maxVal, Point *minLoc, Point *maxLoc, InputArray mask=noArray())(Global Namespace)']]], + ['minmaxval_5f_226',['minMaxVal_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf18a35345e39d8e38a32d6396e30a8e',1,'cv::cudev::minMaxVal_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf18a35345e39d8e38a32d6396e30a8e',1,'minMaxVal_()(Global Namespace)']]], + ['minorversion_227',['minorVersion',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a2dfd3373e10731b54083ebd415009679',1,'cv::cuda::DeviceInfo']]], + ['minval_5f_228',['minVal_',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba7fa397fed60ac4af5595a4dce4d92a',1,'cv::cudev::minVal_()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba7fa397fed60ac4af5595a4dce4d92a',1,'minVal_()(Global Namespace)']]], + ['mismatch_229',['mismatch',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga44ee120346d18fb398be3891eb4a8c0c',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad3cb7460f4803c1073882c89456bb75c',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga67d3e43b97d25f32dd1661a93aa85ff1',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga07f5690e64fb9ece316f84ec99c28e5d',1,'std::mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _BinaryPredicate __binary_pred)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga44ee120346d18fb398be3891eb4a8c0c',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#gad3cb7460f4803c1073882c89456bb75c',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _BinaryPredicate __binary_pred)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga67d3e43b97d25f32dd1661a93aa85ff1',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html#ga07f5690e64fb9ece316f84ec99c28e5d',1,'mismatch(_InputIterator1 __first1, _InputIterator1 __last1, _InputIterator2 __first2, _InputIterator2 __last2, _BinaryPredicate __binary_pred)(Global Namespace)']]], + ['missingvalue_230',['missingValue',['https://docs.opencv.org/4.2.0/dc/d32/classcv_1_1ml_1_1TrainData.html#a852e02da238303d33fd5923b75657584',1,'cv::ml::TrainData']]], + ['mixchannels_231',['mixChannels',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga51d768c270a1cdd3497255017c4504be',1,'cv::mixChannels(const Mat *src, size_t nsrcs, Mat *dst, size_t ndsts, const int *fromTo, size_t npairs)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga89dd05fd8fe54f5b7b5d89bca21153a1',1,'cv::mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const int *fromTo, size_t npairs)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga83b61f9875e6618ee08487b21ec71ab1',1,'cv::mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const std::vector< int > &fromTo)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga51d768c270a1cdd3497255017c4504be',1,'mixChannels(const Mat *src, size_t nsrcs, Mat *dst, size_t ndsts, const int *fromTo, size_t npairs)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga89dd05fd8fe54f5b7b5d89bca21153a1',1,'mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const int *fromTo, size_t npairs)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga83b61f9875e6618ee08487b21ec71ab1',1,'mixChannels(InputArrayOfArrays src, InputOutputArrayOfArrays dst, const std::vector< int > &fromTo)(Global Namespace)']]], + ['mkview_232',['mkView',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a6f0fc00343ffd3e22573d85864785f39',1,'cv::gapi::fluid::Buffer']]], + ['mlab_233',['mlab',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1aa89085077df1acc691a2f02f39cefd',1,'cv::viz::Color']]], + ['model_234',['Model',['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a5ccfd862a641a6b48472a88d821f33bf',1,'cv::dnn::Model::Model()'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#a7ad13e315a170b9c5e3ca212a1a0a909',1,'cv::dnn::Model::Model(const String &model, const String &config="")'],['https://docs.opencv.org/4.2.0/d3/df0/classcv_1_1dnn_1_1Model.html#aeda26984960f2985f0071e33a51b34d3',1,'cv::dnn::Model::Model(const Net &network)']]], + ['modelestimation_235',['modelEstimation',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a84d712f280d1c4d0a8311f8f53089a2e',1,'cv::TrackerModel']]], + ['modelestimationimpl_236',['modelEstimationImpl',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#ad528142f5c5a1d2a7e122f54384a63ae',1,'cv::TrackerModel']]], + ['modelupdate_237',['modelUpdate',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a5049f30348c44b6aebb3651f3767dab0',1,'cv::TrackerModel']]], + ['modelupdateimpl_238',['modelUpdateImpl',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#a6e17cc80adc68abf0c172be19b4bdc8a',1,'cv::TrackerModel']]], + ['modifiedcensustransform_239',['modifiedCensusTransform',['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#a27aeb319591612c6833327da2708277c',1,'cv::stereo::modifiedCensusTransform(const cv::Mat &img1, const cv::Mat &img2, int kernelSize, cv::Mat &dist1, cv::Mat &dist2, const int type, int t=0, const cv::Mat &IntegralImage1=cv::Mat::zeros(100, 100, CV_8UC1), const cv::Mat &IntegralImage2=cv::Mat::zeros(100, 100, CV_8UC1))'],['https://docs.opencv.org/4.2.0/d2/d7f/namespacecv_1_1stereo.html#af330a2a2f52998367d0c845f62d022a6',1,'cv::stereo::modifiedCensusTransform(const cv::Mat &img1, int kernelSize, cv::Mat &dist, const int type, int t=0, const cv::Mat &IntegralImage=cv::Mat::zeros(100, 100, CV_8UC1))']]], + ['modifiedcscensus_240',['ModifiedCsCensus',['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#a2d69cd7875e886e398ebabe4dab2b7e3',1,'cv::stereo::ModifiedCsCensus::ModifiedCsCensus()'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#aedb39a47b4821dd3deb2cc334daeabcd',1,'cv::stereo::ModifiedCsCensus::ModifiedCsCensus(uint8_t **images, int ker)']]], + ['moments_241',['Moments',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a0382b98fdb23acdcb05c91a2a44e5a1f',1,'cv::Moments::Moments()'],['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ab8972f76cccd51af351cbda199fb4a0d',1,'cv::Moments::Moments(double m00, double m10, double m01, double m20, double m11, double m02, double m30, double m21, double m12, double m03)']]], + ['moments_242',['moments',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga556a180f43cab22649c23ada36a8a139',1,'cv::moments()'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#ga556a180f43cab22649c23ada36a8a139',1,'moments()(Global Namespace)']]], + ['money_5fget_243',['money_get',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a56b27ade4915b3ac1ae0e358f5f6266e',1,'std::money_get']]], + ['money_5fput_244',['money_put',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a69471496da9b95b41529a08b14c063f5',1,'std::money_put']]], + ['moneypunct_245',['moneypunct',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a82d4bbb3eaae4c5cf74e3652be13e67e',1,'std::moneypunct::moneypunct(size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#aaabd1d7f1c7014add2c854305c76e73a',1,'std::moneypunct::moneypunct(__cache_type *__cache, size_t __refs=0)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a26aa970ef261e45586f3b161d2ec28e7',1,'std::moneypunct::moneypunct(__c_locale __cloc, const char *__s, size_t __refs=0)']]], + ['moreaccuratemotionwobblesuppressorbase_246',['MoreAccurateMotionWobbleSuppressorBase',['https://docs.opencv.org/4.2.0/d0/d53/classcv_1_1videostab_1_1MoreAccurateMotionWobbleSuppressorBase.html#a5c92896a72d9f706bca04fae077f614f',1,'cv::videostab::MoreAccurateMotionWobbleSuppressorBase']]], + ['morph_247',['morph',['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga24d63a25f503c51da1d80c5d86cc27bd',1,'cv::hal::morph()'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html#ga24d63a25f503c51da1d80c5d86cc27bd',1,'morph()(Global Namespace)']]], + ['morphologydefaultbordervalue_248',['morphologyDefaultBorderValue',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga94756fad83d9d24d29c9bf478558c40a',1,'cv::morphologyDefaultBorderValue()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga94756fad83d9d24d29c9bf478558c40a',1,'morphologyDefaultBorderValue()(Global Namespace)']]], + ['morphologyex_249',['morphologyEx',['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga67493776e3ad1a3df63883829375201f',1,'cv::morphologyEx()'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga939a4d8afa86b012f6e3d006e6a32180',1,'cv::ximgproc::rl::morphologyEx()'],['https://docs.opencv.org/4.2.0/d4/d86/group__imgproc__filter.html#ga67493776e3ad1a3df63883829375201f',1,'morphologyEx(InputArray src, OutputArray dst, int op, InputArray kernel, Point anchor=Point(-1,-1), int iterations=1, int borderType=BORDER_CONSTANT, const Scalar &borderValue=morphologyDefaultBorderValue())(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html#ga939a4d8afa86b012f6e3d006e6a32180',1,'morphologyEx(InputArray rlSrc, OutputArray rlDest, int op, InputArray rlKernel, bool bBoundaryOnForErosion=true, Point anchor=Point(0, 0))(Global Namespace)']]], + ['mosaic_250',['Mosaic',['https://docs.opencv.org/4.2.0/d0/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Mosaic.html#ad655ea1c3d0eff93300e5cbcbbe434b6',1,'cv::gapi::wip::draw::Mosaic']]], + ['motionestimator_251',['motionEstimator',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a8ab5adc5cefe91ef4397bd2d01111b26',1,'cv::videostab::StabilizerBase::motionEstimator()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#ab4290a6b6ae538ca60c644cb7cf34038',1,'cv::videostab::WobbleSuppressorBase::motionEstimator()']]], + ['motionestimatorbase_252',['MotionEstimatorBase',['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html#ab1bc0253fe2d279148445e0e2f42c508',1,'cv::videostab::MotionEstimatorBase']]], + ['motionestimatorl1_253',['MotionEstimatorL1',['https://docs.opencv.org/4.2.0/d7/d29/classcv_1_1videostab_1_1MotionEstimatorL1.html#adc5c868f661775fb37a31a51ab1ea0d7',1,'cv::videostab::MotionEstimatorL1']]], + ['motionestimatorransacl2_254',['MotionEstimatorRansacL2',['https://docs.opencv.org/4.2.0/d6/dbe/classcv_1_1videostab_1_1MotionEstimatorRansacL2.html#ae7d9545b45bc537042cdc4251a8237ca',1,'cv::videostab::MotionEstimatorRansacL2']]], + ['motionfilter_255',['motionFilter',['https://docs.opencv.org/4.2.0/d3/db1/classcv_1_1videostab_1_1OnePassStabilizer.html#a3b34bc7dc9c291f603aacb971fe41ee5',1,'cv::videostab::OnePassStabilizer']]], + ['motionfromessential_256',['motionFromEssential',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaee634880c5f298096ab2fc514de87cbd',1,'cv::sfm::motionFromEssential()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#gaee634880c5f298096ab2fc514de87cbd',1,'motionFromEssential()(Global Namespace)']]], + ['motionfromessentialchoosesolution_257',['motionFromEssentialChooseSolution',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga6bd98cb968781abf62659eedc0d0481e',1,'cv::sfm::motionFromEssentialChooseSolution()'],['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html#ga6bd98cb968781abf62659eedc0d0481e',1,'motionFromEssentialChooseSolution()(Global Namespace)']]], + ['motioninpainter_258',['MotionInpainter',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#aebf592dca89ac5e3f3cf94180b1fcad4',1,'cv::videostab::MotionInpainter']]], + ['motionmodel_259',['motionModel',['https://docs.opencv.org/4.2.0/d4/dd1/classcv_1_1videostab_1_1ImageMotionEstimatorBase.html#a841d954ea87bc9453590180096b36646',1,'cv::videostab::ImageMotionEstimatorBase::motionModel()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a0ad21d4676d5e0d07766f124f90b1a7e',1,'cv::videostab::InpainterBase::motionModel()'],['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#aef396847ece742047bcf40a415ffa898',1,'cv::videostab::KeypointBasedMotionEstimator::motionModel()'],['https://docs.opencv.org/4.2.0/d3/d59/classcv_1_1videostab_1_1LpMotionStabilizer.html#a29e99ca5a23db566de09744a291363c5',1,'cv::videostab::LpMotionStabilizer::motionModel()'],['https://docs.opencv.org/4.2.0/db/df1/classcv_1_1videostab_1_1MotionEstimatorBase.html#a7a848cee402585520565e8346221af68',1,'cv::videostab::MotionEstimatorBase::motionModel()'],['https://docs.opencv.org/4.2.0/dc/dc1/classcv_1_1videostab_1_1ToFileMotionWriter.html#ac7c4c2596a7b18602ec444f4c3642409',1,'cv::videostab::ToFileMotionWriter::motionModel()']]], + ['motions_260',['motions',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a03c5fbf6b554fa16313e5966d4f650a9',1,'cv::videostab::DeblurerBase::motions()'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#acd8158287f603009374c282ce20ccc95',1,'cv::videostab::InpainterBase::motions()'],['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#a4f646cec10ba28feddd082134edf2a60',1,'cv::videostab::WobbleSuppressorBase::motions() const']]], + ['motions2_261',['motions2',['https://docs.opencv.org/4.2.0/d8/d16/classcv_1_1videostab_1_1WobbleSuppressorBase.html#ad60cdff01ba2c03f41000bcfa422b97b',1,'cv::videostab::WobbleSuppressorBase']]], + ['motionsaliencybinwangapr2014_262',['MotionSaliencyBinWangApr2014',['https://docs.opencv.org/4.2.0/dc/d9b/classcv_1_1saliency_1_1MotionSaliencyBinWangApr2014.html#a48791bfcad75fa0572683f23a2fbb3c8',1,'cv::saliency::MotionSaliencyBinWangApr2014']]], + ['motionstabilizer_263',['motionStabilizer',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a7d5d9714f66ed34381f21f9e416a3c75',1,'cv::videostab::TwoPassStabilizer']]], + ['mouseevent_264',['MouseEvent',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a2566c9701613232f23ba6d9bae559853',1,'cv::viz::MouseEvent']]], + ['mov_265',['mov',['https://docs.opencv.org/4.2.0/df/d63/classcv_1_1detail_1_1BasicVectorRef.html#aa176aefc4d3a43adba8fda62632e1f1c',1,'cv::detail::BasicVectorRef::mov()'],['https://docs.opencv.org/4.2.0/d6/dab/classcv_1_1detail_1_1VectorRef.html#a51c97bca58c3b1894fa588e45dcdf370',1,'cv::detail::VectorRef::mov()'],['https://docs.opencv.org/4.2.0/d2/dab/classcv_1_1detail_1_1VectorRefT.html#a91343bb7c3b8bd2960721ef84d778dcc',1,'cv::detail::VectorRefT::mov()']]], + ['move_266',['move',['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ab6a8109eb6c9bb2e04fe32247d32eb59',1,'cv::_OutputArray::move(UMat &u) const'],['https://docs.opencv.org/4.2.0/d2/d9e/classcv_1_1__OutputArray.html#ab185427c5ad1b0a5c75a0eae05171663',1,'cv::_OutputArray::move(Mat &m) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9f81219bfbfaac50d44f79095a639620',1,'std::move(_Tp &&__t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaedffc88b77674cbf9966e30a9c275bb6',1,'std::move(_II __first, _II __last, _OI __result)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#gaedffc88b77674cbf9966e30a9c275bb6',1,'move(_II __first, _II __last, _OI __result)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9f81219bfbfaac50d44f79095a639620',1,'move(_Tp &&__t) noexcept(Global Namespace)']]], + ['move_5fbackward_267',['move_backward',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga1743475fe627f5302b98ae41f8bf0ad5',1,'std::move_backward()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html#ga1743475fe627f5302b98ae41f8bf0ad5',1,'move_backward()(Global Namespace)']]], + ['move_5fif_5fnoexcept_268',['move_if_noexcept',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gad065507b1d170a56e1ee2c77251554a3',1,'std::move_if_noexcept()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#gad065507b1d170a56e1ee2c77251554a3',1,'move_if_noexcept()(Global Namespace)']]], + ['movewindow_269',['moveWindow',['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8d86b207f7211250dbe6e28f76307ffb',1,'cv::moveWindow()'],['https://docs.opencv.org/4.2.0/d7/dfc/group__highgui.html#ga8d86b207f7211250dbe6e28f76307ffb',1,'moveWindow()(Global Namespace)']]], + ['mserstoerstats_270',['MSERsToERStats',['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gaa40b490a66fa21eb1d89163202f69c86',1,'cv::text::MSERsToERStats()'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html#gaa40b490a66fa21eb1d89163202f69c86',1,'MSERsToERStats()(Global Namespace)']]], + ['mul_271',['mul',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a385c09827713dc3e6d713bfad8460706',1,'cv::Mat::mul()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0e80cbf0fa6ed1187294697ab2b674ca',1,'cv::MatExpr::mul(const MatExpr &e, double scale=1) const'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a3be890f1c079879bbd106050972f24ea',1,'cv::MatExpr::mul(const Mat &m, double scale=1) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'cv::Matx::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< _Tp, cn, 1 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 1, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 2, 2 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 2, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 3, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 3, 4 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, 4, 4 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< double, cn, 1 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float, 2, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float, 3, 3 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float, cn, 1 >::mul()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#afd1da25627683af42e0a878a25679af9',1,'Matx< float_type, 4, 4 >::mul()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a0ef9335f112158eed19fd91fac110414',1,'cv::Scalar_::mul()'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a0ef9335f112158eed19fd91fac110414',1,'Scalar_< double >::mul()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#af50d8160ca05a304b30c1dd64ae20755',1,'cv::UMat::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'cv::Vec::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< _Tp, 4 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, 2 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, 3 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, 4 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, GPCPatchDescriptor::nFeatures >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< double, nFeatures >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< float, 2 >::mul()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa589d89684b9ef16dbc5f2603c0f53a2',1,'Vec< float, 3 >::mul()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga42a8187b2bf350f90e4a31f93e929e51',1,'cv::gapi::mul()'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga42a8187b2bf350f90e4a31f93e929e51',1,'mul()(Global Namespace)']]], + ['mul16s_272',['mul16s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8fb6f980b109edb1e4e0107334693ac9',1,'cv::hal::mul16s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga8fb6f980b109edb1e4e0107334693ac9',1,'mul16s()(Global Namespace)']]], + ['mul16u_273',['mul16u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga242229fc8cc1fe5f840c737fc8d27e77',1,'cv::hal::mul16u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga242229fc8cc1fe5f840c737fc8d27e77',1,'mul16u()(Global Namespace)']]], + ['mul32f_274',['mul32f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1a577a4621637502343531e62aba9e4',1,'cv::hal::mul32f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gae1a577a4621637502343531e62aba9e4',1,'mul32f()(Global Namespace)']]], + ['mul32s_275',['mul32s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga87426b5ce323eee5c97f92f082df8c5c',1,'cv::hal::mul32s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga87426b5ce323eee5c97f92f082df8c5c',1,'mul32s()(Global Namespace)']]], + ['mul64f_276',['mul64f',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38bd2b62ad3fa7906495708f82d16718',1,'cv::hal::mul64f()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga38bd2b62ad3fa7906495708f82d16718',1,'mul64f()(Global Namespace)']]], + ['mul8s_277',['mul8s',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacf694c2099ea3046ff44575570235fc4',1,'cv::hal::mul8s()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gacf694c2099ea3046ff44575570235fc4',1,'mul8s()(Global Namespace)']]], + ['mul8u_278',['mul8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3dd47e9d72de2668e8a1ae6b5ec99b29',1,'cv::hal::mul8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#ga3dd47e9d72de2668e8a1ae6b5ec99b29',1,'mul8u()(Global Namespace)']]], + ['muladd_279',['mulAdd',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafe33592336ab4182d98316e65a151ccd',1,'cv::mulAdd(const softfloat &a, const softfloat &b, const softfloat &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafd3f019e0be823233d1a74330e3b2849',1,'cv::mulAdd(const softdouble &a, const softdouble &b, const softdouble &c)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafe33592336ab4182d98316e65a151ccd',1,'mulAdd(const softfloat &a, const softfloat &b, const softfloat &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafd3f019e0be823233d1a74330e3b2849',1,'mulAdd(const softdouble &a, const softdouble &b, const softdouble &c)(Global Namespace)']]], + ['mulandscalespectrums_280',['mulAndScaleSpectrums',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga5704c25b8be4f19da812e6d98c8ee464',1,'cv::cuda::mulAndScaleSpectrums()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#ga5704c25b8be4f19da812e6d98c8ee464',1,'mulAndScaleSpectrums()(Global Namespace)']]], + ['mulc_281',['mulC',['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa924c8c082e0476e4d846843d5f8bed3',1,'cv::gapi::mulC(const GMat &src, double multiplier, int ddepth=-1)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga173028247b9426f6e744c18df02c10f1',1,'cv::gapi::mulC(const GMat &src, const GScalar &multiplier, int ddepth=-1)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga29ed07435c1ab0da02627303594a9b73',1,'cv::gapi::mulC(const GScalar &multiplier, const GMat &src, int ddepth=-1)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#gaa924c8c082e0476e4d846843d5f8bed3',1,'mulC(const GMat &src, double multiplier, int ddepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga173028247b9426f6e744c18df02c10f1',1,'mulC(const GMat &src, const GScalar &multiplier, int ddepth=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html#ga29ed07435c1ab0da02627303594a9b73',1,'mulC(const GScalar &multiplier, const GMat &src, int ddepth=-1)(Global Namespace)']]], + ['mulspectrums_282',['mulSpectrums',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3ab38646463c59bf0ce962a9d51db64f',1,'cv::mulSpectrums()'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#gab3e8900d67c4f59bdc137a0495206cd8',1,'cv::cuda::mulSpectrums()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga3ab38646463c59bf0ce962a9d51db64f',1,'mulSpectrums(InputArray a, InputArray b, OutputArray c, int flags, bool conjB=false)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html#gab3e8900d67c4f59bdc137a0495206cd8',1,'mulSpectrums(InputArray src1, InputArray src2, OutputArray dst, int flags, bool conjB=false, Stream &stream=Stream::Null())(Global Namespace)']]], + ['multibandblender_283',['MultiBandBlender',['https://docs.opencv.org/4.2.0/d5/d4b/classcv_1_1detail_1_1MultiBandBlender.html#a22b424c9587d07da189cd1f15c664424',1,'cv::detail::MultiBandBlender']]], + ['multicameracalibration_284',['MultiCameraCalibration',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#a8fefc924b521891bfe9affebefd2ccbc',1,'cv::multicalib::MultiCameraCalibration']]], + ['multimap_285',['multimap',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#acf3e6ab93785da86f181b584656de15d',1,'std::multimap::multimap()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1b00cb262efce13e4e5c323732c13109',1,'std::multimap::multimap(const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a75ee670e7ff1b74c62d3443ec05a9e4b',1,'std::multimap::multimap(const multimap &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#acbad3010aae4c8ce7ceb97ec5e2daff9',1,'std::multimap::multimap(multimap &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a64de4362141668b6b36fb6a399dbc9d4',1,'std::multimap::multimap(initializer_list< value_type > __l, const _Compare &__comp=_Compare(), const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a0ae31ea18b1274e6e6409795ae5286eb',1,'std::multimap::multimap(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a8105fc127e9fc15e90a050d7e0f7f11a',1,'std::multimap::multimap(const multimap &__m, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a1093b678ea48aa26495ce2bbaf5dd4d7',1,'std::multimap::multimap(multimap &&__m, const allocator_type &__a) noexcept(is_nothrow_copy_constructible< _Compare >::value &&_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#aac222575af5d9600a5651357a978ecd6',1,'std::multimap::multimap(initializer_list< value_type > __l, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a4e1269440d1164dc556209ee07982358',1,'std::multimap::multimap(_InputIterator __first, _InputIterator __last, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ab2d27f68df308a944b432dbf91433e46',1,'std::multimap::multimap(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#ad11e806c3a5c1db4b888eac55459bbb3',1,'std::multimap::multimap(_InputIterator __first, _InputIterator __last, const _Compare &__comp, const allocator_type &__a=allocator_type())']]], + ['multiply_286',['multiply',['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#ac5a4ac08519b8229bfa99fba68f3bdc2',1,'cv::MatOp::multiply(const MatExpr &expr1, const MatExpr &expr2, MatExpr &res, double scale=1) const'],['https://docs.opencv.org/4.2.0/d1/d9d/classcv_1_1MatOp.html#a5c992cafa34003955815dcaf95f5e745',1,'cv::MatOp::multiply(const MatExpr &expr1, double s, MatExpr &res) const'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga979d898a58d7f61c53003e162e7ad89f',1,'cv::multiply()'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga497cc0615bf717e1e615143b56f00591',1,'cv::cuda::multiply()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ga979d898a58d7f61c53003e162e7ad89f',1,'multiply(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html#ga497cc0615bf717e1e615143b56f00591',1,'multiply(InputArray src1, InputArray src2, OutputArray dst, double scale=1, int dtype=-1, Stream &stream=Stream::Null())(Global Namespace)']]], + ['multiprocessorcount_287',['multiProcessorCount',['https://docs.opencv.org/4.2.0/d7/d7c/classcv_1_1cuda_1_1DeviceInfo.html#a8b4c6b2aed8ee5285bff0e42746fa363',1,'cv::cuda::DeviceInfo']]], + ['multiseq_5fpartition_288',['multiseq_partition',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ade1f4c5da0794c4f1a09465d4aee6c1d',1,'__gnu_parallel']]], + ['multiseq_5fselection_289',['multiseq_selection',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a68f665a2f83172d9e12b8332ce573d5d',1,'__gnu_parallel']]], + ['multiset_290',['multiset',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a694c6f511cd8cd15e116062bcaef1dc4',1,'std::multiset::multiset()=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a38e27d171934c562e8f5fc48fba81564',1,'std::multiset::multiset(const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ac561d1612797aaf6022b371cce116035',1,'std::multiset::multiset(_InputIterator __first, _InputIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae6acd6b5095c21d2a04c7d9afa6b02ab',1,'std::multiset::multiset(_InputIterator __first, _InputIterator __last, const _Compare &__comp, const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#aeed9cc573fe8a3346634b3f28dda12a2',1,'std::multiset::multiset(const multiset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a851d2cffcf7183d7a16423d4964f8047',1,'std::multiset::multiset(multiset &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#adad316ede7ac22b3eff955eb6d9ab327',1,'std::multiset::multiset(initializer_list< value_type > __l, const _Compare &__comp=_Compare(), const allocator_type &__a=allocator_type())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#ae8a1847b51c056d1abbc01fb76742632',1,'std::multiset::multiset(const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a3ada945ca3237945e666bdc541accba1',1,'std::multiset::multiset(const multiset &__m, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a0bf2a4cf104ce19a863ac0438e1d3070',1,'std::multiset::multiset(multiset &&__m, const allocator_type &__a) noexcept(is_nothrow_copy_constructible< _Compare >::value &&_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a4bd596fbcfa91841dc0bfe442177c5ac',1,'std::multiset::multiset(initializer_list< value_type > __l, const allocator_type &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a15b3f5d46a91d60ee98c0ac7f278476a',1,'std::multiset::multiset(_InputIterator __first, _InputIterator __last, const allocator_type &__a)']]], + ['multitracker_291',['MultiTracker',['https://docs.opencv.org/4.2.0/d8/d77/classcv_1_1MultiTracker.html#a919f18c31b860b5b20e372881b9f2265',1,'cv::MultiTracker']]], + ['multitracker_5falt_292',['MultiTracker_Alt',['https://docs.opencv.org/4.2.0/dc/dfc/classcv_1_1MultiTracker__Alt.html#a24a9ebc9e0753576a13f8437e88b08e0',1,'cv::MultiTracker_Alt']]], + ['multiway_5fmerge_293',['multiway_merge',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a25294b0a47406aefa9ebc5e0c151d0ce',1,'__gnu_parallel']]], + ['multiway_5fmerge_5f3_5fvariant_294',['multiway_merge_3_variant',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a7ee9d79b73a6f85ae97e472312ba411e',1,'__gnu_parallel']]], + ['multiway_5fmerge_5f4_5fvariant_295',['multiway_merge_4_variant',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#ac4af8f9977aa36823357bce35be6c946',1,'__gnu_parallel']]], + ['multiway_5fmerge_5fexact_5fsplitting_296',['multiway_merge_exact_splitting',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a567621588e461a8759651e29cd964ab9',1,'__gnu_parallel']]], + ['multiway_5fmerge_5floser_5ftree_297',['multiway_merge_loser_tree',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a150b06a4da2cf1cff673d1b6242c27fa',1,'__gnu_parallel']]], + ['multiway_5fmerge_5floser_5ftree_5fsentinel_298',['multiway_merge_loser_tree_sentinel',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a686704fa4da0a4fdbc6800fe46048366',1,'__gnu_parallel']]], + ['multiway_5fmerge_5floser_5ftree_5funguarded_299',['multiway_merge_loser_tree_unguarded',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a3ffd0c9da50da6118291d38f95d44b52',1,'__gnu_parallel']]], + ['multiway_5fmerge_5fsampling_5fsplitting_300',['multiway_merge_sampling_splitting',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a0e39d3891745fd0e244fb125bf34ce8b',1,'__gnu_parallel']]], + ['multiway_5fmerge_5fsentinels_301',['multiway_merge_sentinels',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01582.html#a4d6e76ac42b48f0033139352dcb0418f',1,'__gnu_parallel']]], + ['multransposed_302',['mulTransposed',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadc4e49f8f7a155044e3be1b9e3b270ab',1,'cv::mulTransposed()'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#gadc4e49f8f7a155044e3be1b9e3b270ab',1,'mulTransposed()(Global Namespace)']]], + ['mustestimatetrimaratio_303',['mustEstimateTrimaRatio',['https://docs.opencv.org/4.2.0/d8/d9c/classcv_1_1videostab_1_1TwoPassStabilizer.html#a39dbf002bfc87325c45726288c278b97',1,'cv::videostab::TwoPassStabilizer']]], + ['mvkernel_304',['MVKernel',['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#a9c14f938c0384395f268d3caa1211c41',1,'cv::stereo::MVKernel::MVKernel()'],['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#ad5be80bc8561c20b861bac19d54bf993',1,'cv::stereo::MVKernel::MVKernel(uint8_t **images, int **integral)']]] ]; diff --git a/search/functions_e.js b/search/functions_e.js index 3e97af1a..699b3a38 100644 --- a/search/functions_e.js +++ b/search/functions_e.js @@ -76,8 +76,8 @@ var searchData= ['noarray_73',['noArray',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gad9287b23bba2fed753b36ef561ae7346',1,'cv::noArray()'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gad9287b23bba2fed753b36ef561ae7346',1,'noArray()(Global Namespace)']]], ['noboolalpha_74',['noboolalpha',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad6ef73da482fa14835d126faec1e4548',1,'std']]], ['nobundleadjuster_75',['NoBundleAdjuster',['https://docs.opencv.org/4.2.0/db/dd4/classcv_1_1detail_1_1NoBundleAdjuster.html#af05ab502734e329c83d08d1bd4b1fef7',1,'cv::detail::NoBundleAdjuster']]], - ['node_76',['node',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a499f156a1dc912aae86f1d725fbb9b77',1,'cv::SparseMat::node(size_t nidx)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ab3e934620dcbc6248a09e2b8a5760b3f',1,'cv::SparseMat::node(size_t nidx) const'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a7ed9e9598e8d21f6dc2d05b0bba0a544',1,'cv::SparseMatConstIterator::node()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a25c6cb8b64be6740da109cffe8667bd8',1,'cv::SparseMatIterator::node()']]], - ['node_77',['Node',['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#a8ccfac7b20d1d2e0aa064932266fda12',1,'cv::Node::Node()'],['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#a1a1cc0c6aeeae4bed3f94013ef9320ff',1,'cv::Node::Node(OBJECT &payload)'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#aa89eb58fece3c80a3821bf7b227e24d9',1,'cv::ml::DTrees::Node::Node()']]], + ['node_76',['Node',['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#a8ccfac7b20d1d2e0aa064932266fda12',1,'cv::Node::Node()'],['https://docs.opencv.org/4.2.0/d3/de3/classcv_1_1Node.html#a1a1cc0c6aeeae4bed3f94013ef9320ff',1,'cv::Node::Node(OBJECT &payload)'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#aa89eb58fece3c80a3821bf7b227e24d9',1,'cv::ml::DTrees::Node::Node()']]], + ['node_77',['node',['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a499f156a1dc912aae86f1d725fbb9b77',1,'cv::SparseMat::node(size_t nidx)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ab3e934620dcbc6248a09e2b8a5760b3f',1,'cv::SparseMat::node(size_t nidx) const'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a7ed9e9598e8d21f6dc2d05b0bba0a544',1,'cv::SparseMatConstIterator::node()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a25c6cb8b64be6740da109cffe8667bd8',1,'cv::SparseMatIterator::node()']]], ['node_5fbegin_78',['node_begin',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html#aca223c3ee20287cd81e0a2531f6c1ae9',1,'__gnu_pbds::detail::ov_tree_map::node_begin() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html#a0219630894698aa4bab588b80ff4ebce',1,'__gnu_pbds::detail::ov_tree_map::node_begin()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html#a838ce48eabe1bc0e39ab30be4db3871d',1,'__gnu_pbds::detail::pat_trie_map::node_begin() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html#ac9b60cb2ae918dc8d324525d78a4f470',1,'__gnu_pbds::detail::pat_trie_map::node_begin()']]], ['node_5fend_79',['node_end',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html#a8e887ff6a27b34396414744b4dda3e29',1,'__gnu_pbds::detail::ov_tree_map::node_end() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11871.html#a3201dc70375ce5c9646bf82e2dfaf110',1,'__gnu_pbds::detail::ov_tree_map::node_end()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html#ac7bae9afb7a1120013b017cf52409090',1,'__gnu_pbds::detail::pat_trie_map::node_end() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11891.html#ad8f66bcf85fce7c72b57f9f050a302d7',1,'__gnu_pbds::detail::pat_trie_map::node_end()']]], ['nodedata_80',['NodeData',['https://docs.opencv.org/4.2.0/d7/dc2/classcv_1_1instr_1_1NodeData.html#a641519557ec9bf51ad37ed4145cf7fef',1,'cv::instr::NodeData::NodeData(const char *funName=0, const char *fileName=NULL, int lineNum=0, void *retAddress=NULL, bool alwaysExpand=false, cv::instr::TYPE instrType=TYPE_GENERAL, cv::instr::IMPL implType=IMPL_PLAIN)'],['https://docs.opencv.org/4.2.0/d7/dc2/classcv_1_1instr_1_1NodeData.html#a6cf6fb25e7041e77c0e3d6374172baee',1,'cv::instr::NodeData::NodeData(NodeData &ref)']]], @@ -193,8 +193,8 @@ var searchData= ['nppstgetactivecudastream_190',['nppStGetActiveCUDAstream',['https://docs.opencv.org/4.2.0/d5/ddd/group__core__npp.html#ga97288d29b9fa9147b21cdcfcf4549e3b',1,]]], ['nppstsetactivecudastream_191',['nppStSetActiveCUDAstream',['https://docs.opencv.org/4.2.0/d5/ddd/group__core__npp.html#gae7bf7a1fddf4185a8f99a5617be3369a',1,]]], ['nth_5felement_192',['nth_element',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a4f2ca9c1c627576aeeaa99181c8c63',1,'std::nth_element(_RandomAccessIterator __first, _RandomAccessIterator __nth, _RandomAccessIterator __last)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6d43f0d62204409f18762c8e1bf1867b',1,'std::nth_element(_RandomAccessIterator __first, _RandomAccessIterator __nth, _RandomAccessIterator __last, _Compare __comp)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga3a4f2ca9c1c627576aeeaa99181c8c63',1,'nth_element(_RandomAccessIterator __first, _RandomAccessIterator __nth, _RandomAccessIterator __last)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01491.html#ga6d43f0d62204409f18762c8e1bf1867b',1,'nth_element(_RandomAccessIterator __first, _RandomAccessIterator __nth, _RandomAccessIterator __last, _Compare __comp)(Global Namespace)']]], - ['null_193',['null',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a0ad26edef3f8d530dcec3192bba82df6.html#a0ad26edef3f8d530dcec3192bba82df6',1,'nlohmann::json_sax']]], - ['null_194',['Null',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a680af5adfeeb1cdaa5b7b13f680c0131',1,'cv::cuda::Stream']]], + ['null_193',['Null',['https://docs.opencv.org/4.2.0/d9/df3/classcv_1_1cuda_1_1Stream.html#a680af5adfeeb1cdaa5b7b13f680c0131',1,'cv::cuda::Stream']]], + ['null_194',['null',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a0ad26edef3f8d530dcec3192bba82df6.html#a0ad26edef3f8d530dcec3192bba82df6',1,'nlohmann::json_sax']]], ['nullaryexpr_195',['NullaryExpr',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5dc65501accd02c30f7c1840c2a30a41',1,'Eigen::DenseBase::NullaryExpr(const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3340c9b997f5b53a0131cf927f93b54c',1,'Eigen::DenseBase::NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9752ee59976a4b4aad860ad1a9093e7f',1,'Eigen::DenseBase::NullaryExpr(Index size, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5dc65501accd02c30f7c1840c2a30a41',1,'DenseBase< ArrayWrapper< ExpressionType > >::NullaryExpr(const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3340c9b997f5b53a0131cf927f93b54c',1,'DenseBase< ArrayWrapper< ExpressionType > >::NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9752ee59976a4b4aad860ad1a9093e7f',1,'DenseBase< ArrayWrapper< ExpressionType > >::NullaryExpr(Index size, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5dc65501accd02c30f7c1840c2a30a41',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NullaryExpr(const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3340c9b997f5b53a0131cf927f93b54c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9752ee59976a4b4aad860ad1a9093e7f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NullaryExpr(Index size, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5dc65501accd02c30f7c1840c2a30a41',1,'DenseBase< Solve< Decomposition, RhsType > >::NullaryExpr(const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3340c9b997f5b53a0131cf927f93b54c',1,'DenseBase< Solve< Decomposition, RhsType > >::NullaryExpr(Index rows, Index cols, const CustomNullaryOp &func)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a9752ee59976a4b4aad860ad1a9093e7f',1,'DenseBase< Solve< Decomposition, RhsType > >::NullaryExpr(Index size, const CustomNullaryOp &func)']]], ['num_5fblocks_196',['num_blocks',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a8c8aff43771b4a33d923ce0e7b952540',1,'std::tr2::dynamic_bitset']]], ['num_5fchildren_197',['num_children',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a78db74c5de3cfff1de97561e5d530147',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::num_children()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a78db74c5de3cfff1de97561e5d530147',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::num_children()']]], diff --git a/search/functions_f.js b/search/functions_f.js index be0a1311..1c712a3a 100644 --- a/search/functions_f.js +++ b/search/functions_f.js @@ -80,100 +80,99 @@ var searchData= ['operator_20streamoff_77',['operator streamoff',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a7da1f1b28792e35537bec6d1bc4feb88',1,'std::fpos']]], ['operator_20string_20_2a_78',['operator String *',['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#abf37a20ae4387196fe2a5684ced410dc',1,'AutoBuffer< String, 1 >']]], ['operator_20string_5ftype_79',['operator string_type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#aaa88132502a374183f5de838441b9002',1,'std::sub_match::operator string_type()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06767.html#aaa88132502a374183f5de838441b9002',1,'sub_match< _Bi_iter >::operator string_type()']]], - ['operator_20t_80',['operator T',['../classrobot_1_1types_1_1DataPoint.html#add5401ce0832af2752f634f80c44c7be',1,'robot::types::DataPoint']]], - ['operator_20uchar_81',['operator uchar',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a8b1a6322d1cac24cd929aecad1041f22',1,'cv::RNG']]], - ['operator_20unsigned_82',['operator unsigned',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a8419e63b25666f77d2d388aaae8122ba',1,'cv::RNG::operator unsigned()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a31e2bc86ef08ccb268a10101ee0ccbbf',1,'cv::RNG_MT19937::operator unsigned()']]], - ['operator_20ushort_83',['operator ushort',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a51e4c416b3ace4840774cceaedcc4b9a',1,'cv::RNG']]], - ['operator_20value_5ft_84',['operator value_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6d4b8df10ecc533a50823e8805f4a873.html#a6d4b8df10ecc533a50823e8805f4a873',1,'nlohmann::basic_json']]], - ['operator_20valuetype_85',['operator ValueType',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ada1463d8d7ba77865f28f5e83dec7f33.html#ada1463d8d7ba77865f28f5e83dec7f33',1,'nlohmann::basic_json']]], - ['operator_20vec3b_86',['operator Vec3b',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#af5807af9aefd3b74c7feab6544828bec',1,'cv::viz::Color']]], - ['operator_20vec_3c_20_5ftp_2c_202_20_3e_87',['operator Vec< _Tp, 2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a625700af6b447b0803907dc6d845a6b4',1,'cv::Point_']]], - ['operator_20vec_3c_20_5ftp_2c_203_20_3e_88',['operator Vec< _Tp, 3 >',['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a13bc76b8cadfd7a7bc903fd8a8be6167',1,'cv::Point3_']]], - ['operator_20vec_3c_20_5ftp_2c_20n_20_3e_89',['operator Vec< _Tp, n >',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ae4766cf75071f4e4db698c4120abe57b',1,'cv::Mat']]], - ['operator_20vec_3c_20double_2c_202_20_3e_90',['operator Vec< double, 2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a625700af6b447b0803907dc6d845a6b4',1,'Point_< double >']]], - ['operator_20vec_3c_20float_2c_202_20_3e_91',['operator Vec< float, 2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a625700af6b447b0803907dc6d845a6b4',1,'Point_< float >']]], - ['operator_20vec_3c_20t2_2c_20cn_20_3e_92',['operator Vec< T2, cn >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'cv::Vec::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< _Tp, 4 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, 2 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, 3 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, 4 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, nFeatures >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< float, 2 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< float, 3 >::operator Vec< T2, cn >()']]], - ['operator_20vec_3c_20typename_20datatype_3c_20_5ftp_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_93',['operator Vec< typename DataType< _Tp >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'cv::Mat_']]], - ['operator_20vec_3c_20typename_20datatype_3c_20double_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_94',['operator Vec< typename DataType< double >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< double >']]], - ['operator_20vec_3c_20typename_20datatype_3c_20float_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_95',['operator Vec< typename DataType< float >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< float >']]], - ['operator_20vec_3c_20typename_20datatype_3c_20uchar_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_96',['operator Vec< typename DataType< uchar >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< uchar >']]], - ['operator_20vec_3c_20typename_20datatype_3c_20unsigned_20char_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_97',['operator Vec< typename DataType< unsigned char >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< unsigned char >']]], - ['operator_21_98',['operator!',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ios< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ios< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_iostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_iostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_fstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_fstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ifstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ifstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ios::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ios::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_iostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_iostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ofstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ofstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_stringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_stringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8ae9cabed8e455713324dacd39bedef1',1,'std::valarray::operator!()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8ae9cabed8e455713324dacd39bedef1',1,'valarray< size_t >::operator!()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedd36c90ccd8d1c8ea0d9d121764687e',1,'cv::cudev::operator!(const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a99111955fe2272dece21813539289',1,'cv::cudev::operator!(const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691ce9b6cae1134cdbf39a5ac37ffbc6',1,'cv::cudev::operator!(const Expr< Body > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad387b8de401308ad8764356a902294d4',1,'cv::cudev::operator!(const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga096854f6b69712bd3a6b08b240b390d8',1,'cv::cudev::operator!(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4d6a028a6b6192bf17c25ca75d7f84',1,'cv::cudev::operator!(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2bc16d5e23552ba6fd31b1912fa4a6f',1,'cv::cudev::operator!(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2f274425168b4133ef5270b0ddae7ae',1,'cv::cudev::operator!(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd37e74306bce3962b9b081db9c6064a',1,'cv::cudev::operator!(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38aa67c0f1b4dc9ebe976cdbb2c45771',1,'cv::cudev::operator!(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a32684d4325c9ac27aa698b23ee0ab',1,'cv::cudev::operator!(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6a772b81ca9afc60e6d06f37443b48f',1,'cv::cudev::operator!(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15b5f3146f6815ccfaa75b313cf1bece',1,'cv::cudev::operator!(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa86526fb4e3341ae51d619b0db2cd379',1,'cv::cudev::operator!(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadca17a33d6f1d4b7c85834a156859940',1,'cv::cudev::operator!(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5072fb2fd15a0e93d7cda0cd295bc894',1,'cv::cudev::operator!(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1938b6ba569496387172de1db0a90a9',1,'cv::cudev::operator!(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga710384a11224d911dc1c06966407b070',1,'cv::cudev::operator!(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4575777615eafb52b138f3f70332fcad',1,'cv::cudev::operator!(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66daea7b4632dffed59485b06e850135',1,'cv::cudev::operator!(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41d458a2f3eb470ef98348bc8dcaeec7',1,'cv::cudev::operator!(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga285b3d30ef7b1b1dcf391e62f0a7ab84',1,'cv::cudev::operator!(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ad51bb71a9827aba1389f15aecaf666',1,'cv::cudev::operator!(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48732936efbae4811ff6bd0a5fa6e018',1,'cv::cudev::operator!(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef97c1bdfbf913fbcb909c9014bf2bd0',1,'cv::cudev::operator!(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a5369d6b2d681d7d61226ab28986a19',1,'cv::cudev::operator!(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55a6f14fd6c882ece5bbbeb8633c9191',1,'cv::cudev::operator!(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfd535749b1c35f92e47e69cab7d08af',1,'cv::cudev::operator!(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b788e3270d0fc245b0566f01415334f',1,'cv::cudev::operator!(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9faa344cc89c3f9896d763e4fa9bb9a4',1,'cv::cudev::operator!(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafef7c2b87b9ce254712c0628519895a5',1,'cv::cudev::operator!(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5414c9eaf8734e95201f4485b744d3b2',1,'cv::cudev::operator!(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0314d3c8d73359a7ce7e39c43ed67568',1,'cv::cudev::operator!(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4d8cc9fe8152f04f27ef3f65eb37db1',1,'cv::cudev::operator!(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d66ce3b8d478e84d239d1f28fcf1cf',1,'cv::cudev::operator!(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca58de1b50f1b0f27f31afa3c1a0082e',1,'cv::cudev::operator!(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedd36c90ccd8d1c8ea0d9d121764687e',1,'operator!(const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a99111955fe2272dece21813539289',1,'operator!(const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691ce9b6cae1134cdbf39a5ac37ffbc6',1,'operator!(const Expr< Body > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad387b8de401308ad8764356a902294d4',1,'operator!(const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga096854f6b69712bd3a6b08b240b390d8',1,'operator!(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4d6a028a6b6192bf17c25ca75d7f84',1,'operator!(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2bc16d5e23552ba6fd31b1912fa4a6f',1,'operator!(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2f274425168b4133ef5270b0ddae7ae',1,'operator!(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd37e74306bce3962b9b081db9c6064a',1,'operator!(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38aa67c0f1b4dc9ebe976cdbb2c45771',1,'operator!(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a32684d4325c9ac27aa698b23ee0ab',1,'operator!(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6a772b81ca9afc60e6d06f37443b48f',1,'operator!(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15b5f3146f6815ccfaa75b313cf1bece',1,'operator!(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa86526fb4e3341ae51d619b0db2cd379',1,'operator!(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadca17a33d6f1d4b7c85834a156859940',1,'operator!(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5072fb2fd15a0e93d7cda0cd295bc894',1,'operator!(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1938b6ba569496387172de1db0a90a9',1,'operator!(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga710384a11224d911dc1c06966407b070',1,'operator!(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4575777615eafb52b138f3f70332fcad',1,'operator!(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66daea7b4632dffed59485b06e850135',1,'operator!(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41d458a2f3eb470ef98348bc8dcaeec7',1,'operator!(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga285b3d30ef7b1b1dcf391e62f0a7ab84',1,'operator!(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ad51bb71a9827aba1389f15aecaf666',1,'operator!(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48732936efbae4811ff6bd0a5fa6e018',1,'operator!(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef97c1bdfbf913fbcb909c9014bf2bd0',1,'operator!(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a5369d6b2d681d7d61226ab28986a19',1,'operator!(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55a6f14fd6c882ece5bbbeb8633c9191',1,'operator!(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfd535749b1c35f92e47e69cab7d08af',1,'operator!(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b788e3270d0fc245b0566f01415334f',1,'operator!(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9faa344cc89c3f9896d763e4fa9bb9a4',1,'operator!(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafef7c2b87b9ce254712c0628519895a5',1,'operator!(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5414c9eaf8734e95201f4485b744d3b2',1,'operator!(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0314d3c8d73359a7ce7e39c43ed67568',1,'operator!(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4d8cc9fe8152f04f27ef3f65eb37db1',1,'operator!(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d66ce3b8d478e84d239d1f28fcf1cf',1,'operator!(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca58de1b50f1b0f27f31afa3c1a0082e',1,'operator!(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8ae9cabed8e455713324dacd39bedef1',1,'operator!() const(Global Namespace)']]], - ['operator_21_3d_99',['operator!=',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a224780d14e4f8aae3e6127d605736bd1',1,'cv::FileNodeIterator::operator!=(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a224780d14e4f8aae3e6127d605736bd1',1,'cv::FileNodeIterator::operator!=(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a6b16d9a0f3bb63fa355a63a05a5fd397',1,'cv::GMatDesc::operator!=()'],['https://docs.opencv.org/4.2.0/d1/d6a/structcv_1_1GScalarDesc.html#a7aa7e15af456abb71d568281f4148781',1,'cv::GScalarDesc::operator!=()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a89ee700214e5c588fc9c2f16dc5f0814',1,'cv::MatExpr::operator!=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0c7b11e74936908ee2fb47e4eb9c5e18',1,'cv::MatExpr::operator!=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a25f71801b3fb6ab5395c2dbcc9cc60ad',1,'cv::MatExpr::operator!=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a76d099d1e862f773c3f0d234b2261feb',1,'cv::MatExpr::operator!=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7105f56350ad1d16b716a3664edbd7f5',1,'cv::MatExpr::operator!=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a89ee700214e5c588fc9c2f16dc5f0814',1,'cv::MatExpr::operator!=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0c7b11e74936908ee2fb47e4eb9c5e18',1,'cv::MatExpr::operator!=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a25f71801b3fb6ab5395c2dbcc9cc60ad',1,'cv::MatExpr::operator!=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a76d099d1e862f773c3f0d234b2261feb',1,'cv::MatExpr::operator!=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7105f56350ad1d16b716a3664edbd7f5',1,'cv::MatExpr::operator!=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#af0917c4e9713001260d67db171256a93',1,'cv::MatSize::operator!=()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'cv::Matx::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'cv::Matx::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< _Tp, cn, 1 >::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< _Tp, cn, 1 >::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 1, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 1, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 2 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 2 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 4, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 4, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, cn, 1 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, cn, 1 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 2, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 2, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 3, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 3, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, cn, 1 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, cn, 1 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float_type, 4, 4 >::operator!=(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float_type, 4, 4 >::operator!=(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3e6d2ce9ae1fc533c68737efecdd1b5b',1,'cv::softdouble::operator!=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafa7691dc904caca8588ea6a4b0954e08',1,'cv::softfloat::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#af00d0999bd1cb1c6a731bf5327caea72',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#af00d0999bd1cb1c6a731bf5327caea72',1,'__gnu_pbds::detail::bin_search_tree_node_it_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#ade2fe116ea5d8252d04e3205d8a097f5',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator!=(const binary_heap_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#ac2a94a28e8beb3b3b2e66632636930f9',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator!=(const binary_heap_point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#ac2a94a28e8beb3b3b2e66632636930f9',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#aa943274d090a3ccb2e74e2937ac00e13',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator!=(const left_child_next_sibling_heap_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#ad5876d650788d02f01035cdb3040dd88',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator!=(const left_child_next_sibling_heap_node_point_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#ad5876d650788d02f01035cdb3040dd88',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a210f5b96aa65b4a025d3f4998378862f',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a210f5b96aa65b4a025d3f4998378862f',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a40cf56640357123e880f39e36454b552',1,'const_iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5b0ebe0ad2f13fb20de8c5cff2855216',1,'const_iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a40cf56640357123e880f39e36454b552',1,'iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5b0ebe0ad2f13fb20de8c5cff2855216',1,'iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a40cf56640357123e880f39e36454b552',1,'point_const_iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5b0ebe0ad2f13fb20de8c5cff2855216',1,'point_const_iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#ae8c663552f5380496391513e71799847',1,'point_iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a0b828d52a1d27c8e786c7171a65bff97',1,'point_iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa69e1223ce6dc3f69fd44cc331bb170e',1,'std::bitset::operator!=(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa69e1223ce6dc3f69fd44cc331bb170e',1,'std::bitset::operator!=(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#adbf547d835746748a205bb57fd81a43f',1,'std::locale::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a2ec683d37e64edce2bea9366a5415677',1,'std::regex_iterator::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a6446149296f14aee3eef4ac516a96f52',1,'std::regex_token_iterator::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a028c7ac8094d610042fd0f9feca68f63',1,'Eigen::MatrixBase::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a028c7ac8094d610042fd0f9feca68f63',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a028c7ac8094d610042fd0f9feca68f63',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'Eigen::QuaternionBase::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator!=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a760bf39cc5477bc663d8bb3c44aabf6a.html#a760bf39cc5477bc663d8bb3c44aabf6a',1,'nlohmann::byte_container_with_subtype::operator!=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacfed05378c432f84c46e3a2e80e321e8',1,'cv::operator!=()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8292fe7dc983ee976f9f112bcb9b6c1d',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7d957663c54fb266f22662e02d515a0',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga134eff23af476bb078268d470c5a1eab',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30827c997d70e1ec669dfe661188bf97',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a85ae32eae025d733fb5e3ef556bf1a',1,'cv::cudev::operator!=(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b6fc14c39892e90df1b408a88f4a89',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae195999272c703fd97df7a3b66e061c1',1,'cv::cudev::operator!=(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a70181a870d6be3b2045a194b2ba0a3',1,'cv::cudev::operator!=(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0433dbcd94c2e678a7c1938c24ee08da',1,'cv::cudev::operator!=(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26dbfbf9dc0e5fc90b82f41229c84899',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1efe076c9144b56c61e17b96fa6e210e',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e37d9a1418a94d91adf91c477519144',1,'cv::cudev::operator!=(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa35d062549d2cfa7d9841e1ac7799a44',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f22949e60450f64d1b3c459de0e7a27',1,'cv::cudev::operator!=(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71df1ef74ebec36966335c1b5449a07b',1,'cv::cudev::operator!=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51b3e383f16f20dc1928d89f4524bce',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a34b56e3225c861848f01b4e3b1c44a',1,'cv::cudev::operator!=(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61134a26d4c0e5ca4467638109358eaa',1,'cv::cudev::operator!=(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac01068a2f43c82f8e14d0ac68996c903',1,'cv::cudev::operator!=(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00b76efa5a61126d47883ddbf36799f0',1,'cv::cudev::operator!=(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1a88913cdea995341a95e23135b06bf',1,'cv::cudev::operator!=(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa295a03a44435b12c5b2ce66bf4c1d8d',1,'cv::cudev::operator!=(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba8ae9e88782d3b46baa0cd308b594ca',1,'cv::cudev::operator!=(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc15d3d94c1bf3032fa82162cd5d08c2',1,'cv::cudev::operator!=(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bbfb03a53e5581effe1f9f98d30873',1,'cv::cudev::operator!=(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35e7a1277bb5d5249c578b0a289f4a5b',1,'cv::cudev::operator!=(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2cfd0dba2d83f0dd7e267fb537c6df3',1,'cv::cudev::operator!=(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga904fe1a365ccf3f52ded833f98ab4c1d',1,'cv::cudev::operator!=(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27dfb14836d9f082e79d9a804291564',1,'cv::cudev::operator!=(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c715a1f404a93f452cd718cd61822ef',1,'cv::cudev::operator!=(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1196cca16594f3ca574ffae1e94e7b1',1,'cv::cudev::operator!=(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2540630d91b7767930621ce3c6fd76e1',1,'cv::cudev::operator!=(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb08af5c7f389e522b5822a4ed2f9461',1,'cv::cudev::operator!=(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23c79a1928e13afc502bb8b7f331e430',1,'cv::cudev::operator!=(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc40e9339bd3ac67fd8cbd5b027e18d',1,'cv::cudev::operator!=(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f3ae663608af22f0c147d4d1c0cec9b',1,'cv::cudev::operator!=(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4dfd8489e7ec481cbe03b56039599e',1,'cv::cudev::operator!=(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae80f5e0d14e29c9a5505deee930a41d7',1,'cv::cudev::operator!=(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad791250abb63d31f2fd906d838f3994a',1,'cv::cudev::operator!=(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ce12579d99d81239384b64b528d9e67',1,'cv::cudev::operator!=(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ddfdc36315c9e7eae56b412d83b0a05',1,'cv::cudev::operator!=(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga781786668348ca67ef6fc9f333fd76bd',1,'cv::cudev::operator!=(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32d5f8d24bdce45881f83215c243ed9d',1,'cv::cudev::operator!=(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ba755d444526c74046317135fdc2f06',1,'cv::cudev::operator!=(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga018afdf83525378f4fb0e87057ddd12c',1,'cv::cudev::operator!=(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fbf5e5e077bbe431d43e5dfc3199595',1,'cv::cudev::operator!=(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a74d8b5cff07e001fa59b0bdf4bdc8',1,'cv::cudev::operator!=(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7e2f8cdd7843ea8e78f8c1e4c69df0b',1,'cv::cudev::operator!=(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d3a7254a567bbb65a400e55dd85ff93',1,'cv::cudev::operator!=(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0e2aaffe5179188a45b52ed7d05b665',1,'cv::cudev::operator!=(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa416b9a794190e20a62b08cde74fa95c',1,'cv::cudev::operator!=(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06e89f04ab74961a37ba14c5e2f84832',1,'cv::cudev::operator!=(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga059791beca5a629072a39a00978f4a7f',1,'cv::cudev::operator!=(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d61cb0c52994efdf53d7c912582bf8b',1,'cv::cudev::operator!=(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7bcfb20794a46293a7d4e7301b44f7',1,'cv::cudev::operator!=(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02ef404a904a3ec832c9add12935eacc',1,'cv::cudev::operator!=(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14e0dc7340bf0380c8e7ff3b6ad61d8d',1,'cv::cudev::operator!=(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35c3b84bb03b81839a2c3e9c1055a80f',1,'cv::cudev::operator!=(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7f1eaafa2eba2a41778d32070a3a2a',1,'cv::cudev::operator!=(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba5e0f75bf2cc2fd562e3df677ea694',1,'cv::cudev::operator!=(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae703f571d189f59c10ac1b776fb51404',1,'cv::cudev::operator!=(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a865177e087ade5119108ad893fc40',1,'cv::cudev::operator!=(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f332aaeee915649e3ba300bfd6e0862',1,'cv::cudev::operator!=(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f549d8efea1133b101ffce070bf7bb1',1,'cv::cudev::operator!=(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3dc461d11161c9c0269d007f9c0664',1,'cv::cudev::operator!=(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301514bbd97b257d879b7b956231618d',1,'cv::cudev::operator!=(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f6246f3563a2788bdab0ffd43946a28',1,'cv::cudev::operator!=(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27c5affcafc4dfbaa5bd97878a85805',1,'cv::cudev::operator!=(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0cda31d15dbbaad26ee24e31deaeb0',1,'cv::cudev::operator!=(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab81a1eee4dcf637837acd349d99bc9',1,'cv::cudev::operator!=(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeac8a5773046490bb3e174f794f9a3bf',1,'cv::cudev::operator!=(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbb8eef6cbff069ea514a1d08d1c1acc',1,'cv::cudev::operator!=(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c79714df94e4874571a6f6fbe802261',1,'cv::cudev::operator!=(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92977e9cd4b8299c7b4193be69e38140',1,'cv::cudev::operator!=(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade3a83bdc7ef86bfdbf599502d46baca',1,'cv::cudev::operator!=(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga770fa7102571a71eecff41db456a32a0',1,'cv::cudev::operator!=(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16f17453bfe07cca9818f9e8b3934955',1,'cv::cudev::operator!=(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37bc7a2403de26ee46a764916836e73',1,'cv::cudev::operator!=(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafaf36c9bcfe7c72a427dfaac657e291d',1,'cv::cudev::operator!=(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadad41dbc0aece9daa78fcf41a69673de',1,'cv::cudev::operator!=(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cb807429ac3b09197050a95728f556a',1,'cv::cudev::operator!=(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba1495d7b1d080f397329f02159c01e',1,'cv::cudev::operator!=(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9baa29316abd1f38a665c6cbc8cacab7',1,'cv::cudev::operator!=(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7603a241df59c649cc55105a1628df',1,'cv::cudev::operator!=(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195211f7ce1c4f3d67db531c2831f724',1,'cv::cudev::operator!=(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41419f07a921918f0701c998a8d76fb',1,'cv::cudev::operator!=(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae089ee9fd05ad99eebf886d55bfe7152',1,'cv::cudev::operator!=(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5dbacd27f428cce7bc009baf93a731f8',1,'cv::cudev::operator!=(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ca3d062d928c0f22cac521b71d9531a',1,'cv::cudev::operator!=(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e9806f1e89dded32d75e063645de53',1,'cv::cudev::operator!=(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e5d5b6b33702c5f4049358633041d36',1,'cv::cudev::operator!=(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga831de1ee68dbe4cabe2785d3b4ee4823',1,'cv::cudev::operator!=(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae125433024aa211123e58c04f034c750',1,'cv::cudev::operator!=(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c10e74e42a3199d23aacd569ecbdf3f',1,'cv::cudev::operator!=(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99fea0f04ddb67c943effb33762e48d',1,'cv::cudev::operator!=(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f4f66d6868e12eaccee9521e2751810',1,'cv::cudev::operator!=(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga358969872ca6b79e0c141bd4682085df',1,'cv::cudev::operator!=(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga300d7581d3c1bc8213d2690878045735',1,'cv::cudev::operator!=(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25c43cc94bc4759b75116adfe773f496',1,'cv::cudev::operator!=(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51077c5df4c6a888b84142e1af07b23',1,'cv::cudev::operator!=(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb9347618d1909b4307d5f5e8d5e0ec1',1,'cv::cudev::operator!=(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70e9295c70897f7ee8f165b2b9b92006',1,'cv::cudev::operator!=(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7816e638f08658a7127889f8924d463a',1,'cv::cudev::operator!=(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec66007c1a31dcf3aa21addda8d2e057',1,'cv::cudev::operator!=(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5df23018756bf58482b48b72f91c69',1,'cv::cudev::operator!=(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9f59dd31ae3f09e713717a052fb2d41',1,'cv::cudev::operator!=(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2edb4f9db0181f0ed159c100272de19e',1,'cv::cudev::operator!=(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14cc69402191ad1a9fadafc1797e4e5',1,'cv::cudev::operator!=(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefc9c61d220f8a87a7c07e07a1de92ef',1,'cv::cudev::operator!=(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c1259a165b16ae5e1a2e7582dc6ca19',1,'cv::cudev::operator!=(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27400033a8ccdaf73828d9569ab1d11f',1,'cv::cudev::operator!=(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64ebcee14a400f7d929e78336d556f76',1,'cv::cudev::operator!=(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c2fc1b7beb65f98f4f60313e89892',1,'cv::cudev::operator!=(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd4ea537ef260913359d331676ee41',1,'cv::cudev::operator!=(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d16922ec836552a427512b69378cea5',1,'cv::cudev::operator!=(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23335c5da9c49fc7fad795f8151ed17e',1,'cv::cudev::operator!=(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e6ecff1ed67f5619c81d15d6c61d2aa',1,'cv::cudev::operator!=(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d04608dbf78c558bbc9fe3157c1fa03',1,'cv::cudev::operator!=(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2b7ac6b676b027054f92659fcbd62b3',1,'cv::cudev::operator!=(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1074c3499e6d2197ec635fb11e013f59',1,'cv::cudev::operator!=(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#ad56f6fcb23f2a9cfb755740235424a11',1,'cv::gapi::operator!=()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a1fd873abaeb604fdbf9e008118552f6e',1,'cv::gapi::own::operator!=(const Rect &lhs, const Rect &rhs)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a9afb185df936f93b5388f549a463e618',1,'cv::gapi::own::operator!=(const Size &lhs, const Size &rhs)'],['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#a026ad4480a333be3a691a7c7311da00b',1,'cv::tbm::operator!=()'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#aefce3a0692acbbc03674218a59ded1bc',1,'cv::util::operator!=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafa7691dc904caca8588ea6a4b0954e08',1,'operator!=(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3e6d2ce9ae1fc533c68737efecdd1b5b',1,'operator!=(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacfed05378c432f84c46e3a2e80e321e8',1,'operator!=(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8292fe7dc983ee976f9f112bcb9b6c1d',1,'operator!=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7d957663c54fb266f22662e02d515a0',1,'operator!=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga134eff23af476bb078268d470c5a1eab',1,'operator!=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30827c997d70e1ec669dfe661188bf97',1,'operator!=(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a85ae32eae025d733fb5e3ef556bf1a',1,'operator!=(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b6fc14c39892e90df1b408a88f4a89',1,'operator!=(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae195999272c703fd97df7a3b66e061c1',1,'operator!=(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a70181a870d6be3b2045a194b2ba0a3',1,'operator!=(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0433dbcd94c2e678a7c1938c24ee08da',1,'operator!=(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26dbfbf9dc0e5fc90b82f41229c84899',1,'operator!=(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1efe076c9144b56c61e17b96fa6e210e',1,'operator!=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e37d9a1418a94d91adf91c477519144',1,'operator!=(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa35d062549d2cfa7d9841e1ac7799a44',1,'operator!=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f22949e60450f64d1b3c459de0e7a27',1,'operator!=(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71df1ef74ebec36966335c1b5449a07b',1,'operator!=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51b3e383f16f20dc1928d89f4524bce',1,'operator!=(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a34b56e3225c861848f01b4e3b1c44a',1,'operator!=(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61134a26d4c0e5ca4467638109358eaa',1,'operator!=(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac01068a2f43c82f8e14d0ac68996c903',1,'operator!=(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00b76efa5a61126d47883ddbf36799f0',1,'operator!=(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1a88913cdea995341a95e23135b06bf',1,'operator!=(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa295a03a44435b12c5b2ce66bf4c1d8d',1,'operator!=(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba8ae9e88782d3b46baa0cd308b594ca',1,'operator!=(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc15d3d94c1bf3032fa82162cd5d08c2',1,'operator!=(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bbfb03a53e5581effe1f9f98d30873',1,'operator!=(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35e7a1277bb5d5249c578b0a289f4a5b',1,'operator!=(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2cfd0dba2d83f0dd7e267fb537c6df3',1,'operator!=(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga904fe1a365ccf3f52ded833f98ab4c1d',1,'operator!=(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27dfb14836d9f082e79d9a804291564',1,'operator!=(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c715a1f404a93f452cd718cd61822ef',1,'operator!=(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1196cca16594f3ca574ffae1e94e7b1',1,'operator!=(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2540630d91b7767930621ce3c6fd76e1',1,'operator!=(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb08af5c7f389e522b5822a4ed2f9461',1,'operator!=(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23c79a1928e13afc502bb8b7f331e430',1,'operator!=(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc40e9339bd3ac67fd8cbd5b027e18d',1,'operator!=(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f3ae663608af22f0c147d4d1c0cec9b',1,'operator!=(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4dfd8489e7ec481cbe03b56039599e',1,'operator!=(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae80f5e0d14e29c9a5505deee930a41d7',1,'operator!=(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad791250abb63d31f2fd906d838f3994a',1,'operator!=(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ce12579d99d81239384b64b528d9e67',1,'operator!=(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ddfdc36315c9e7eae56b412d83b0a05',1,'operator!=(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga781786668348ca67ef6fc9f333fd76bd',1,'operator!=(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32d5f8d24bdce45881f83215c243ed9d',1,'operator!=(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ba755d444526c74046317135fdc2f06',1,'operator!=(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga018afdf83525378f4fb0e87057ddd12c',1,'operator!=(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fbf5e5e077bbe431d43e5dfc3199595',1,'operator!=(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a74d8b5cff07e001fa59b0bdf4bdc8',1,'operator!=(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7e2f8cdd7843ea8e78f8c1e4c69df0b',1,'operator!=(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d3a7254a567bbb65a400e55dd85ff93',1,'operator!=(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0e2aaffe5179188a45b52ed7d05b665',1,'operator!=(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa416b9a794190e20a62b08cde74fa95c',1,'operator!=(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06e89f04ab74961a37ba14c5e2f84832',1,'operator!=(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga059791beca5a629072a39a00978f4a7f',1,'operator!=(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d61cb0c52994efdf53d7c912582bf8b',1,'operator!=(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7bcfb20794a46293a7d4e7301b44f7',1,'operator!=(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02ef404a904a3ec832c9add12935eacc',1,'operator!=(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14e0dc7340bf0380c8e7ff3b6ad61d8d',1,'operator!=(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35c3b84bb03b81839a2c3e9c1055a80f',1,'operator!=(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7f1eaafa2eba2a41778d32070a3a2a',1,'operator!=(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba5e0f75bf2cc2fd562e3df677ea694',1,'operator!=(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae703f571d189f59c10ac1b776fb51404',1,'operator!=(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a865177e087ade5119108ad893fc40',1,'operator!=(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f332aaeee915649e3ba300bfd6e0862',1,'operator!=(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f549d8efea1133b101ffce070bf7bb1',1,'operator!=(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3dc461d11161c9c0269d007f9c0664',1,'operator!=(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301514bbd97b257d879b7b956231618d',1,'operator!=(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f6246f3563a2788bdab0ffd43946a28',1,'operator!=(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27c5affcafc4dfbaa5bd97878a85805',1,'operator!=(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0cda31d15dbbaad26ee24e31deaeb0',1,'operator!=(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab81a1eee4dcf637837acd349d99bc9',1,'operator!=(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeac8a5773046490bb3e174f794f9a3bf',1,'operator!=(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbb8eef6cbff069ea514a1d08d1c1acc',1,'operator!=(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c79714df94e4874571a6f6fbe802261',1,'operator!=(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92977e9cd4b8299c7b4193be69e38140',1,'operator!=(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade3a83bdc7ef86bfdbf599502d46baca',1,'operator!=(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga770fa7102571a71eecff41db456a32a0',1,'operator!=(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16f17453bfe07cca9818f9e8b3934955',1,'operator!=(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37bc7a2403de26ee46a764916836e73',1,'operator!=(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafaf36c9bcfe7c72a427dfaac657e291d',1,'operator!=(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadad41dbc0aece9daa78fcf41a69673de',1,'operator!=(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cb807429ac3b09197050a95728f556a',1,'operator!=(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba1495d7b1d080f397329f02159c01e',1,'operator!=(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9baa29316abd1f38a665c6cbc8cacab7',1,'operator!=(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7603a241df59c649cc55105a1628df',1,'operator!=(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195211f7ce1c4f3d67db531c2831f724',1,'operator!=(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41419f07a921918f0701c998a8d76fb',1,'operator!=(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae089ee9fd05ad99eebf886d55bfe7152',1,'operator!=(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5dbacd27f428cce7bc009baf93a731f8',1,'operator!=(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ca3d062d928c0f22cac521b71d9531a',1,'operator!=(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e9806f1e89dded32d75e063645de53',1,'operator!=(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e5d5b6b33702c5f4049358633041d36',1,'operator!=(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga831de1ee68dbe4cabe2785d3b4ee4823',1,'operator!=(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae125433024aa211123e58c04f034c750',1,'operator!=(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c10e74e42a3199d23aacd569ecbdf3f',1,'operator!=(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99fea0f04ddb67c943effb33762e48d',1,'operator!=(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f4f66d6868e12eaccee9521e2751810',1,'operator!=(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga358969872ca6b79e0c141bd4682085df',1,'operator!=(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga300d7581d3c1bc8213d2690878045735',1,'operator!=(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25c43cc94bc4759b75116adfe773f496',1,'operator!=(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51077c5df4c6a888b84142e1af07b23',1,'operator!=(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb9347618d1909b4307d5f5e8d5e0ec1',1,'operator!=(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70e9295c70897f7ee8f165b2b9b92006',1,'operator!=(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7816e638f08658a7127889f8924d463a',1,'operator!=(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec66007c1a31dcf3aa21addda8d2e057',1,'operator!=(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5df23018756bf58482b48b72f91c69',1,'operator!=(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9f59dd31ae3f09e713717a052fb2d41',1,'operator!=(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2edb4f9db0181f0ed159c100272de19e',1,'operator!=(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14cc69402191ad1a9fadafc1797e4e5',1,'operator!=(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefc9c61d220f8a87a7c07e07a1de92ef',1,'operator!=(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c1259a165b16ae5e1a2e7582dc6ca19',1,'operator!=(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27400033a8ccdaf73828d9569ab1d11f',1,'operator!=(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64ebcee14a400f7d929e78336d556f76',1,'operator!=(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c2fc1b7beb65f98f4f60313e89892',1,'operator!=(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd4ea537ef260913359d331676ee41',1,'operator!=(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d16922ec836552a427512b69378cea5',1,'operator!=(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23335c5da9c49fc7fad795f8151ed17e',1,'operator!=(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e6ecff1ed67f5619c81d15d6c61d2aa',1,'operator!=(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d04608dbf78c558bbc9fe3157c1fa03',1,'operator!=(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2b7ac6b676b027054f92659fcbd62b3',1,'operator!=(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1074c3499e6d2197ec635fb11e013f59',1,'operator!=(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ab051cea08cf039852e3351b93b8c5a81',1,'__gnu_cxx::operator!=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a1181402b4656a1da4bf2e9608aed3c38',1,'__gnu_cxx::operator!=(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a9deee1071e354ea98296b431b4643511',1,'__gnu_cxx::operator!=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga51a6d053b3eb004ee172b8e7ef066854',1,'std::operator!=(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a481ee02f06a7c42bd2762516975d7082',1,'std::operator!=(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a98c391c7d64a5a01cf0d162c4fb959ca',1,'std::operator!=(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#gafb9c9578afd0299fc357581cb848f2fd',1,'std::operator!=(const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__lhs, const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga226dae1d9406b9c3804f20d31c15e21a',1,'std::operator!=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga08598cac266ed03507603ca6d6c27ce2',1,'std::operator!=(const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__lhs, const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a48d985ba8cc72e159372b14b9114da73',1,'std::operator!=(const function< _Res(_Args...)> &__f, nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac0daaa77f5550fd185352175aa05fc89',1,'std::operator!=(nullptr_t, const function< _Res(_Args...)> &__f) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga58cddddd716e5fe8d9ef54732399b68f',1,'std::operator!=(const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__lhs, const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a20729b0ed4cf42aa7dba9c24e71243f0',1,'std::operator!=(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2855896e6ac169748344ed4e2f064ccb',1,'std::operator!=(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e9b319feda06c3f9bbc8c501d7ed5c',1,'std::operator!=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga223f7056b37b325f9d70eda843982dff',1,'std::operator!=(const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__lhs, const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga26b97c6b57337790d75c65c39461d57b',1,'std::operator!=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a376c99e0db4e24c69c2beecd6c11b54e',1,'std::operator!=(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c4c0391a3cd864c981a2752bbb39e87',1,'std::operator!=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c5fbbe825fb3b00793f87d5b0f84b37',1,'std::operator!=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga8ad332f998832aa3bbf426abf441c34a',1,'std::operator!=(const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__lhs, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeffd353ea0720cf2338ac2cd23511b9f',1,'std::operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafd4ac060b48dc528864dcb79b7ac47b9',1,'std::operator!=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae4e62dff9be77e98ba29da34c0eee1b7',1,'std::operator!=(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6b5d199f9e89bfca5738b76671a4118b',1,'std::operator!=(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4a40078467f136b65820875414060d72',1,'std::operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga47c5a5d9835e00a60a76f4be7ea0f671',1,'std::operator!=(const std::shuffle_order_engine< _RandomNumberEngine, __k > &__lhs, const std::shuffle_order_engine< _RandomNumberEngine, __k > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gaca2a091ac2ef5b09deba9d1d185b16ad',1,'std::operator!=(const std::uniform_int_distribution< _IntType > &__d1, const std::uniform_int_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa8e4871fc2d47ad1f14e43949b9ce938',1,'std::operator!=(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gae4180334ebfbfbbae6f1f9901819a52e',1,'std::operator!=(const std::uniform_real_distribution< _IntType > &__d1, const std::uniform_real_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gade5eaebb40897ed5c453b3d1ef9ee18d',1,'std::operator!=(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a44ba4a39615cc57e58325da2c9a2372c',1,'std::operator!=(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga227eec7c437a7d893172e4387a0fb041',1,'std::operator!=(const std::normal_distribution< _RealType > &__d1, const std::normal_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a01fe16a0529fecdacda453c5cb1ce28a',1,'std::operator!=(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga611caefadf0614ec3e3a5bd8a95c11ac',1,'std::operator!=(const std::lognormal_distribution< _RealType > &__d1, const std::lognormal_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gafdf8a737eaa64e171fd0617603e7a6a7',1,'std::operator!=(const std::gamma_distribution< _RealType > &__d1, const std::gamma_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gac4dbdb98454ba9eac4efedb236380fff',1,'std::operator!=(const std::chi_squared_distribution< _RealType > &__d1, const std::chi_squared_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gaf8d44ddbae75bc9aac07aca501130b3a',1,'std::operator!=(const std::cauchy_distribution< _RealType > &__d1, const std::cauchy_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabeee8cc21eaf2d1ac14d819e56e933ee',1,'std::operator!=(const std::fisher_f_distribution< _RealType > &__d1, const std::fisher_f_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga9f65157c0c5e6316e415b7fbf5edbad4',1,'std::operator!=(const std::student_t_distribution< _RealType > &__d1, const std::student_t_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga1b42c0c69b003733630addb17455e78c',1,'std::operator!=(const std::bernoulli_distribution &__d1, const std::bernoulli_distribution &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga03255c2d29292408f9e417d8c19749d5',1,'std::operator!=(const std::binomial_distribution< _IntType > &__d1, const std::binomial_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#gada2797560998107294e60ece46615d73',1,'std::operator!=(const std::geometric_distribution< _IntType > &__d1, const std::geometric_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga0ecd009cd763508bbac68e62a14fa73c',1,'std::operator!=(const std::negative_binomial_distribution< _IntType > &__d1, const std::negative_binomial_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga16e064b3a8822c1a5b84e0b146b2a701',1,'std::operator!=(const std::poisson_distribution< _IntType > &__d1, const std::poisson_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gadb6734dde139796b0c17ab7da2092000',1,'std::operator!=(const std::exponential_distribution< _RealType > &__d1, const std::exponential_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga93a5f8cbd4387728796f825a8004f3fe',1,'std::operator!=(const std::weibull_distribution< _RealType > &__d1, const std::weibull_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga7cb0e95ae2658e8fbce52e9b83969955',1,'std::operator!=(const std::extreme_value_distribution< _RealType > &__d1, const std::extreme_value_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gaf7323b91cdc741135f4099930580987b',1,'std::operator!=(const std::discrete_distribution< _IntType > &__d1, const std::discrete_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga1c4c402db457c46e730ba427efda1f5a',1,'std::operator!=(const std::piecewise_constant_distribution< _RealType > &__d1, const std::piecewise_constant_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga34f4ca07d82381cbfd41b4563b5f265e',1,'std::operator!=(const std::piecewise_linear_distribution< _RealType > &__d1, const std::piecewise_linear_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9551f72d5a20e1b3db6d73876b71be9c',1,'std::operator!=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad109463a06be6ce8e32bd270cc92e7c8',1,'std::operator!=(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5cc85385236f8a6157f148fcf2505196',1,'std::operator!=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga73a0309c22f804987d01e41c3af8d953',1,'std::operator!=(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga4f04509aa5b848bb961d6c4898fc8ee6',1,'std::operator!=(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga05e38fe09ca2ceb867e8cbaf0df2d43b',1,'std::operator!=(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#a90a8bcb2378458899b902c6eb8834bd2',1,'std::rel_ops::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga2b4bf8c35aa9cd820d1bc042accb8687',1,'std::tr2::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga1b42c0c69b003733630addb17455e78c',1,'operator!=(const std::bernoulli_distribution &__d1, const std::bernoulli_distribution &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga03255c2d29292408f9e417d8c19749d5',1,'operator!=(const std::binomial_distribution< _IntType > &__d1, const std::binomial_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#gada2797560998107294e60ece46615d73',1,'operator!=(const std::geometric_distribution< _IntType > &__d1, const std::geometric_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga0ecd009cd763508bbac68e62a14fa73c',1,'operator!=(const std::negative_binomial_distribution< _IntType > &__d1, const std::negative_binomial_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga73a0309c22f804987d01e41c3af8d953',1,'operator!=(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga4f04509aa5b848bb961d6c4898fc8ee6',1,'operator!=(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga05e38fe09ca2ceb867e8cbaf0df2d43b',1,'operator!=(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga2b4bf8c35aa9cd820d1bc042accb8687',1,'operator!=(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga51a6d053b3eb004ee172b8e7ef066854',1,'operator!=(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga227eec7c437a7d893172e4387a0fb041',1,'operator!=(const std::normal_distribution< _RealType > &__d1, const std::normal_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga611caefadf0614ec3e3a5bd8a95c11ac',1,'operator!=(const std::lognormal_distribution< _RealType > &__d1, const std::lognormal_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gafdf8a737eaa64e171fd0617603e7a6a7',1,'operator!=(const std::gamma_distribution< _RealType > &__d1, const std::gamma_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gac4dbdb98454ba9eac4efedb236380fff',1,'operator!=(const std::chi_squared_distribution< _RealType > &__d1, const std::chi_squared_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gaf8d44ddbae75bc9aac07aca501130b3a',1,'operator!=(const std::cauchy_distribution< _RealType > &__d1, const std::cauchy_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabeee8cc21eaf2d1ac14d819e56e933ee',1,'operator!=(const std::fisher_f_distribution< _RealType > &__d1, const std::fisher_f_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga9f65157c0c5e6316e415b7fbf5edbad4',1,'operator!=(const std::student_t_distribution< _RealType > &__d1, const std::student_t_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga16e064b3a8822c1a5b84e0b146b2a701',1,'operator!=(const std::poisson_distribution< _IntType > &__d1, const std::poisson_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gadb6734dde139796b0c17ab7da2092000',1,'operator!=(const std::exponential_distribution< _RealType > &__d1, const std::exponential_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga93a5f8cbd4387728796f825a8004f3fe',1,'operator!=(const std::weibull_distribution< _RealType > &__d1, const std::weibull_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga7cb0e95ae2658e8fbce52e9b83969955',1,'operator!=(const std::extreme_value_distribution< _RealType > &__d1, const std::extreme_value_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gaf7323b91cdc741135f4099930580987b',1,'operator!=(const std::discrete_distribution< _IntType > &__d1, const std::discrete_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga1c4c402db457c46e730ba427efda1f5a',1,'operator!=(const std::piecewise_constant_distribution< _RealType > &__d1, const std::piecewise_constant_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga34f4ca07d82381cbfd41b4563b5f265e',1,'operator!=(const std::piecewise_linear_distribution< _RealType > &__d1, const std::piecewise_linear_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#gafb9c9578afd0299fc357581cb848f2fd',1,'operator!=(const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__lhs, const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga08598cac266ed03507603ca6d6c27ce2',1,'operator!=(const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__lhs, const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga58cddddd716e5fe8d9ef54732399b68f',1,'operator!=(const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__lhs, const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga223f7056b37b325f9d70eda843982dff',1,'operator!=(const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__lhs, const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga8ad332f998832aa3bbf426abf441c34a',1,'operator!=(const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__lhs, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga47c5a5d9835e00a60a76f4be7ea0f671',1,'operator!=(const std::shuffle_order_engine< _RandomNumberEngine, __k > &__lhs, const std::shuffle_order_engine< _RandomNumberEngine, __k > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e9b319feda06c3f9bbc8c501d7ed5c',1,'operator!=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga26b97c6b57337790d75c65c39461d57b',1,'operator!=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c4c0391a3cd864c981a2752bbb39e87',1,'operator!=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c5fbbe825fb3b00793f87d5b0f84b37',1,'operator!=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeffd353ea0720cf2338ac2cd23511b9f',1,'operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafd4ac060b48dc528864dcb79b7ac47b9',1,'operator!=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4a40078467f136b65820875414060d72',1,'operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gade5eaebb40897ed5c453b3d1ef9ee18d',1,'operator!=(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gaca2a091ac2ef5b09deba9d1d185b16ad',1,'operator!=(const std::uniform_int_distribution< _IntType > &__d1, const std::uniform_int_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gae4180334ebfbfbbae6f1f9901819a52e',1,'operator!=(const std::uniform_real_distribution< _IntType > &__d1, const std::uniform_real_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga226dae1d9406b9c3804f20d31c15e21a',1,'operator!=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], - ['operator_25_100',['operator%',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6ec4cce27f5f5c22c51fd8923d0f11',1,'cv::softdouble::operator%()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga69f4dbc0a0eace2d056676b41ca65ff2',1,'cv::softfloat::operator%()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa37b11432b1ebde054af826f340a2c31',1,'cv::cudev::operator%(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab31dfd9be961e597a6ff20fe16aa442b',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga773b0b2650985c05a19fc3b2cea02157',1,'cv::cudev::operator%(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e04cff3e3f4dc32f4ad6f4ea1a175f1',1,'cv::cudev::operator%(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b8b1d46430656d69ace43bf63ef5a03',1,'cv::cudev::operator%(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9aa960339addec61dae59f72ad661f6',1,'cv::cudev::operator%(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59fd9fd64abbdbf6d02111258ff3ee3a',1,'cv::cudev::operator%(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dcc4a1f5610061e0994d8554cfc765b',1,'cv::cudev::operator%(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6093692666282b857f5c312c9669def',1,'cv::cudev::operator%(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9290539128e5d0844f4480b49b3d7088',1,'cv::cudev::operator%(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9373b5425bc87bbf899c139216f9a60a',1,'cv::cudev::operator%(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82bdb4bd976961e8077c200d91a371e3',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d5639fedbfd3ea5fae538d1ccbb97f4',1,'cv::cudev::operator%(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga761216132a87e3c512b66743403bd25e',1,'cv::cudev::operator%(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4a930fbaafd0bef775d17c39a71fc97',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa27152eb3298e3345232dd01c77c0d',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57c116145cb62d4a4027f9639145aa45',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb82ed401680a151f1d811f79c907687',1,'cv::cudev::operator%(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20f538ce841c4168ea7b676bc4d721ce',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea561c006efad0fe66fb54961baf414f',1,'cv::cudev::operator%(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74bf8c1b04c651db7c598cf7064b763',1,'cv::cudev::operator%(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5314568374d8a1d07ca11c4bb88047c',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7714be790d76153dbdc8d751a943bc',1,'cv::cudev::operator%(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d4e175fcb53cd7926bc3787754faf86',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga69f4dbc0a0eace2d056676b41ca65ff2',1,'operator%(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6ec4cce27f5f5c22c51fd8923d0f11',1,'operator%(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa37b11432b1ebde054af826f340a2c31',1,'operator%(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab31dfd9be961e597a6ff20fe16aa442b',1,'operator%(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga773b0b2650985c05a19fc3b2cea02157',1,'operator%(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e04cff3e3f4dc32f4ad6f4ea1a175f1',1,'operator%(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b8b1d46430656d69ace43bf63ef5a03',1,'operator%(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9aa960339addec61dae59f72ad661f6',1,'operator%(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59fd9fd64abbdbf6d02111258ff3ee3a',1,'operator%(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dcc4a1f5610061e0994d8554cfc765b',1,'operator%(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6093692666282b857f5c312c9669def',1,'operator%(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9290539128e5d0844f4480b49b3d7088',1,'operator%(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9373b5425bc87bbf899c139216f9a60a',1,'operator%(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82bdb4bd976961e8077c200d91a371e3',1,'operator%(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d5639fedbfd3ea5fae538d1ccbb97f4',1,'operator%(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga761216132a87e3c512b66743403bd25e',1,'operator%(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4a930fbaafd0bef775d17c39a71fc97',1,'operator%(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa27152eb3298e3345232dd01c77c0d',1,'operator%(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57c116145cb62d4a4027f9639145aa45',1,'operator%(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb82ed401680a151f1d811f79c907687',1,'operator%(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20f538ce841c4168ea7b676bc4d721ce',1,'operator%(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea561c006efad0fe66fb54961baf414f',1,'operator%(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74bf8c1b04c651db7c598cf7064b763',1,'operator%(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5314568374d8a1d07ca11c4bb88047c',1,'operator%(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7714be790d76153dbdc8d751a943bc',1,'operator%(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d4e175fcb53cd7926bc3787754faf86',1,'operator%(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)']]], - ['operator_25_3d_101',['operator%=',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae22a90109adc61a7fba881c7f495002f',1,'cv::softdouble::operator%=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4bd168a6fe89d0016b05917d2c067e00',1,'cv::softfloat::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga707e141e760766ca9cbdb6be26941cd4',1,'std::gslice_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaec955c90f1d087dd1a6a2bd41a5cea7a',1,'std::indirect_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa321a7c18f23aae720cdd059ea38fcc2',1,'std::mask_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga51b2370973ce4cfa93b21428c23e3da0',1,'std::slice_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga64fd546424cb6eb21396e7049fb2c17e',1,'std::valarray::operator%=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc5edf2598de6c9bbfe67c8cdc7ff3ab',1,'std::valarray::operator%=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga64fd546424cb6eb21396e7049fb2c17e',1,'valarray< size_t >::operator%=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc5edf2598de6c9bbfe67c8cdc7ff3ab',1,'valarray< size_t >::operator%=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4bd168a6fe89d0016b05917d2c067e00',1,'operator%=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae22a90109adc61a7fba881c7f495002f',1,'operator%=(const softdouble &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga707e141e760766ca9cbdb6be26941cd4',1,'operator%=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga64fd546424cb6eb21396e7049fb2c17e',1,'operator%=(const _Tp &)(Global Namespace)']]], - ['operator_26_102',['operator&',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad5ca0810ca85918075da95a79d9a97f7',1,'cv::MatExpr::operator&(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac2374f3eaff03e88ed89e166a68d2ae0',1,'cv::MatExpr::operator&(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2a9d86f1b3e1c8840fbcdaedc357c3dc',1,'cv::MatExpr::operator&(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abdc64797e9de5a15144a9c6faff33638',1,'cv::MatExpr::operator&(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab86886f75e72d222c79be0eef13e54ad',1,'cv::MatExpr::operator&(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad5ca0810ca85918075da95a79d9a97f7',1,'cv::MatExpr::operator&(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac2374f3eaff03e88ed89e166a68d2ae0',1,'cv::MatExpr::operator&(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2a9d86f1b3e1c8840fbcdaedc357c3dc',1,'cv::MatExpr::operator&(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abdc64797e9de5a15144a9c6faff33638',1,'cv::MatExpr::operator&(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab86886f75e72d222c79be0eef13e54ad',1,'cv::MatExpr::operator&(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6957bb19d507c40a6915ddd22d1249c4',1,'cv::operator&()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2824fbead5dd62215b4a3962cd3265a3',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac81e02d2c96e3a90c65ce87da156d271',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga144767d1bb4daf6ea0fda36e2e20d4ca',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322dc9a03abc6081db6a879167ebd0c4',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c02de846f3e7774b67e6cb212f91649',1,'cv::cudev::operator&(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691cca0881f07410c194b6b1026a77fb',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e44f3fd51a9f96cc64728aa9c30b0e',1,'cv::cudev::operator&(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd9a0060a95f7eaa54e4de45114028ba',1,'cv::cudev::operator&(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5998775c6f8394bae10ff602c588608',1,'cv::cudev::operator&(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f774843bd845f4bc86e06bdb6c31408',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga238c55671d39087ce44545a5ed98ab1c',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab70b9ac4715868342622dd46f9d29d6a',1,'cv::cudev::operator&(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab73b7952cc39f426b985c670ce7f5b52',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8eae30f62afa2a06307185a43725c74',1,'cv::cudev::operator&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga094b70ca656ab78b3b1f781f929f7567',1,'cv::cudev::operator&(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0913f4f62618507ffc8c0d16251044cd',1,'cv::cudev::operator&(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86dc7c80ee41020ef9ff3b62ae4a2cb6',1,'cv::cudev::operator&(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e6bf0498079e6b9f44052db5b1e89',1,'cv::cudev::operator&(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3476659b715cb17d4c7cb0e217b803d',1,'cv::cudev::operator&(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8498963f3694cb7e5559c1fa089122e',1,'cv::cudev::operator&(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1715d8f7390bd9637882e80d266d8962',1,'cv::cudev::operator&(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad955789a18991c3c601fb6d95cdde9d9',1,'cv::cudev::operator&(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6189769261ab09d9f2f88b0d95d9b69c',1,'cv::cudev::operator&(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47b903733bfaf612b130ab5feaa4e834',1,'cv::cudev::operator&(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6680357b706655b3d4f59ebf6cde1bda',1,'cv::cudev::operator&(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga410ee41519d0e468f977064eca80ca6b',1,'cv::cudev::operator&(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga933b51f3537cb5bd2ca304032f702301',1,'cv::cudev::operator&(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3d2a81a49a5b4ae71bea0e1086650e5',1,'cv::cudev::operator&(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f515f625c04355b920763fbb60934f1',1,'cv::cudev::operator&(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1433b28090a0d04a08045f8de4fecce6',1,'cv::cudev::operator&(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga142e290d05fe7b33f550490478e6bf1c',1,'cv::cudev::operator&(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3956877ec91ef9b8bfd3b4cdf9e7834',1,'cv::cudev::operator&(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d052d31f5b99e648bec17eabcf72643',1,'cv::cudev::operator&(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga447adc88942acc85e431fb7c02584d25',1,'cv::cudev::operator&(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9c66db9a9cfaea6024241e8b1a6acd',1,'cv::cudev::operator&(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d8637568a82c8c300778bd702219d74',1,'cv::cudev::operator&(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga020bb49349993c9d1b6088426f81dfce',1,'cv::cudev::operator&(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50d73894dfb821ab9e3d7aefafed6075',1,'cv::cudev::operator&(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5585ad32954a8f0720a5d88668161ff',1,'cv::cudev::operator&(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7902b60973c6adc297c83152ac0806',1,'cv::cudev::operator&(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0318ec2367da1e372fd5e28b1eab218b',1,'cv::cudev::operator&(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac701681464db5140bc0fab9835f95115',1,'cv::cudev::operator&(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17af2a172ba1fa5938a093c4f9c0eac5',1,'cv::cudev::operator&(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0b49b7d04484f831a731783656099d2',1,'cv::cudev::operator&(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75427aad0e6d9c3c2d6fa9cb246c227d',1,'cv::cudev::operator&(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64f469db78287435cc118baca7fc9a59',1,'cv::cudev::operator&(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44adf7d1bca7f3db25e94fc301c7d678',1,'cv::cudev::operator&(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69834e5b601a5b3bcd816f707b7b3b39',1,'cv::cudev::operator&(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b9761105bb7f9de7916d7d18c7b59bc',1,'cv::cudev::operator&(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab3eb409493f1177554f7cd8a1606318',1,'cv::cudev::operator&(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0eeb6595b46265a3e9bdf9132960798',1,'cv::cudev::operator&(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7977db362f2714454a13ce8be3cf7d35',1,'cv::cudev::operator&(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa25aab84c9af7fcb275c62366cda31ff',1,'cv::cudev::operator&(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd225b01b0b95ad01a57d361b5378ad9',1,'cv::cudev::operator&(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a57e28ab5789a6ab5e3763d7eae3a5e',1,'cv::cudev::operator&(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09703b8694475c3f60d87240ead7ab9c',1,'cv::cudev::operator&(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9250d1f6ecee8ad1dc4b7ca2f8119d7a',1,'cv::cudev::operator&(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga600dc4708da63b278579de8250268fda',1,'cv::cudev::operator&(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12da3f8eecbcdcbdfda3b88b0656de26',1,'cv::cudev::operator&(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72c946da7805977984f0c3e67805271f',1,'cv::cudev::operator&(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12cbff5375b5fe75cb11aa1ceec29e12',1,'cv::cudev::operator&(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e56c435219a48922c9e0bc4dbae5731',1,'cv::cudev::operator&(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f3310022e46b2058670f9d6d9299f39',1,'cv::cudev::operator&(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2d39ebbf206189dc22406a1a2fed139',1,'cv::cudev::operator&(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga068e477cd2843f7b78897fa476592131',1,'cv::cudev::operator&(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51bb0adc5368740ed76777f54a476874',1,'cv::cudev::operator&(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2978c32bb65ec46ca1d351ed7a3eae6',1,'cv::cudev::operator&(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87142039aff3429c8a5a07e52a30f857',1,'cv::cudev::operator&(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cf577b65c982883d6e83281db193dee',1,'cv::cudev::operator&(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8427d79ce048b5397fd13acfe46b0cb8',1,'cv::cudev::operator&(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c00c23cee32f10298bafb1f26393f7b',1,'cv::cudev::operator&(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68e97414257334444f9b1238164108f9',1,'cv::cudev::operator&(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ffa9ba4cd1b5284df92cb84f52d893f',1,'cv::cudev::operator&(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d94fd3ad9493292e1015a141cb3b75',1,'cv::cudev::operator&(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c39d2a806d68167e5bec9b1bef88fa5',1,'cv::cudev::operator&(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa46e182b2a2cf5fb4e36d9872ef0f643',1,'cv::cudev::operator&(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d014dc5b0c60ccbee2f4818a6b2057b',1,'cv::cudev::operator&(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2b5c40d3f569407c9a67bfc1e6b7e89',1,'cv::cudev::operator&(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga099252f9ea434dc03ebd12a8d6ad446e',1,'cv::cudev::operator&(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae242e51d22b353b9ddcff233be97be6f',1,'cv::cudev::operator&(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17e0ec430072e4254a93b539475a5aa1',1,'cv::cudev::operator&(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga883ec5e2401d4cba39d1e4a61b968d94',1,'cv::cudev::operator&(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf31f6fafe2187bc62231e4d0af623cad',1,'cv::cudev::operator&(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc1e6f9244edefd36feff70a5eb86150',1,'cv::cudev::operator&(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab69568bca24e4407e2658ac08a843681',1,'cv::cudev::operator&(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04720d9d8f413cfb21fcb97e53435911',1,'cv::cudev::operator&(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86170e2b7b037f8d980d18f876e72c8d',1,'cv::cudev::operator&(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0707c9dedfd86a692e37e96fe1661ca',1,'cv::cudev::operator&(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6cf168e908a747b46770c3c49cc239',1,'cv::cudev::operator&(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9886a421fb77d7c4b6c69fb3265e3a5b',1,'cv::cudev::operator&(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac32cf95373924bf8cecb00934eeb13ce',1,'cv::cudev::operator&(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac45d05b0b072454d8a1e434bc31a2622',1,'cv::cudev::operator&(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f62603bc29e2ad5f85228039996f9f',1,'cv::cudev::operator&(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf63f98e35a6ecd4b52e32c00aec377ce',1,'cv::cudev::operator&(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga167cfb86156279d9446b2428dfcdf459',1,'cv::cudev::operator&(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19d008f7753dd3651d38cf48c2fef06c',1,'cv::cudev::operator&(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ab76078d3f1909db7086b0360c9fc8b6d',1,'cv::gapi::own::operator&()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6957bb19d507c40a6915ddd22d1249c4',1,'operator&(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2824fbead5dd62215b4a3962cd3265a3',1,'operator&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac81e02d2c96e3a90c65ce87da156d271',1,'operator&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga144767d1bb4daf6ea0fda36e2e20d4ca',1,'operator&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322dc9a03abc6081db6a879167ebd0c4',1,'operator&(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c02de846f3e7774b67e6cb212f91649',1,'operator&(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691cca0881f07410c194b6b1026a77fb',1,'operator&(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e44f3fd51a9f96cc64728aa9c30b0e',1,'operator&(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd9a0060a95f7eaa54e4de45114028ba',1,'operator&(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5998775c6f8394bae10ff602c588608',1,'operator&(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f774843bd845f4bc86e06bdb6c31408',1,'operator&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga238c55671d39087ce44545a5ed98ab1c',1,'operator&(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab70b9ac4715868342622dd46f9d29d6a',1,'operator&(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab73b7952cc39f426b985c670ce7f5b52',1,'operator&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8eae30f62afa2a06307185a43725c74',1,'operator&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga094b70ca656ab78b3b1f781f929f7567',1,'operator&(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0913f4f62618507ffc8c0d16251044cd',1,'operator&(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86dc7c80ee41020ef9ff3b62ae4a2cb6',1,'operator&(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e6bf0498079e6b9f44052db5b1e89',1,'operator&(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3476659b715cb17d4c7cb0e217b803d',1,'operator&(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8498963f3694cb7e5559c1fa089122e',1,'operator&(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1715d8f7390bd9637882e80d266d8962',1,'operator&(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad955789a18991c3c601fb6d95cdde9d9',1,'operator&(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6189769261ab09d9f2f88b0d95d9b69c',1,'operator&(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47b903733bfaf612b130ab5feaa4e834',1,'operator&(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6680357b706655b3d4f59ebf6cde1bda',1,'operator&(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga410ee41519d0e468f977064eca80ca6b',1,'operator&(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga933b51f3537cb5bd2ca304032f702301',1,'operator&(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3d2a81a49a5b4ae71bea0e1086650e5',1,'operator&(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f515f625c04355b920763fbb60934f1',1,'operator&(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1433b28090a0d04a08045f8de4fecce6',1,'operator&(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga142e290d05fe7b33f550490478e6bf1c',1,'operator&(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3956877ec91ef9b8bfd3b4cdf9e7834',1,'operator&(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d052d31f5b99e648bec17eabcf72643',1,'operator&(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga447adc88942acc85e431fb7c02584d25',1,'operator&(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9c66db9a9cfaea6024241e8b1a6acd',1,'operator&(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d8637568a82c8c300778bd702219d74',1,'operator&(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga020bb49349993c9d1b6088426f81dfce',1,'operator&(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50d73894dfb821ab9e3d7aefafed6075',1,'operator&(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5585ad32954a8f0720a5d88668161ff',1,'operator&(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7902b60973c6adc297c83152ac0806',1,'operator&(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0318ec2367da1e372fd5e28b1eab218b',1,'operator&(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac701681464db5140bc0fab9835f95115',1,'operator&(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17af2a172ba1fa5938a093c4f9c0eac5',1,'operator&(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0b49b7d04484f831a731783656099d2',1,'operator&(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75427aad0e6d9c3c2d6fa9cb246c227d',1,'operator&(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64f469db78287435cc118baca7fc9a59',1,'operator&(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44adf7d1bca7f3db25e94fc301c7d678',1,'operator&(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69834e5b601a5b3bcd816f707b7b3b39',1,'operator&(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b9761105bb7f9de7916d7d18c7b59bc',1,'operator&(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab3eb409493f1177554f7cd8a1606318',1,'operator&(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0eeb6595b46265a3e9bdf9132960798',1,'operator&(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7977db362f2714454a13ce8be3cf7d35',1,'operator&(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa25aab84c9af7fcb275c62366cda31ff',1,'operator&(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd225b01b0b95ad01a57d361b5378ad9',1,'operator&(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a57e28ab5789a6ab5e3763d7eae3a5e',1,'operator&(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09703b8694475c3f60d87240ead7ab9c',1,'operator&(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9250d1f6ecee8ad1dc4b7ca2f8119d7a',1,'operator&(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga600dc4708da63b278579de8250268fda',1,'operator&(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12da3f8eecbcdcbdfda3b88b0656de26',1,'operator&(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72c946da7805977984f0c3e67805271f',1,'operator&(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12cbff5375b5fe75cb11aa1ceec29e12',1,'operator&(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e56c435219a48922c9e0bc4dbae5731',1,'operator&(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f3310022e46b2058670f9d6d9299f39',1,'operator&(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2d39ebbf206189dc22406a1a2fed139',1,'operator&(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga068e477cd2843f7b78897fa476592131',1,'operator&(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51bb0adc5368740ed76777f54a476874',1,'operator&(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2978c32bb65ec46ca1d351ed7a3eae6',1,'operator&(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87142039aff3429c8a5a07e52a30f857',1,'operator&(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cf577b65c982883d6e83281db193dee',1,'operator&(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8427d79ce048b5397fd13acfe46b0cb8',1,'operator&(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c00c23cee32f10298bafb1f26393f7b',1,'operator&(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68e97414257334444f9b1238164108f9',1,'operator&(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ffa9ba4cd1b5284df92cb84f52d893f',1,'operator&(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d94fd3ad9493292e1015a141cb3b75',1,'operator&(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c39d2a806d68167e5bec9b1bef88fa5',1,'operator&(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa46e182b2a2cf5fb4e36d9872ef0f643',1,'operator&(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d014dc5b0c60ccbee2f4818a6b2057b',1,'operator&(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2b5c40d3f569407c9a67bfc1e6b7e89',1,'operator&(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga099252f9ea434dc03ebd12a8d6ad446e',1,'operator&(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae242e51d22b353b9ddcff233be97be6f',1,'operator&(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17e0ec430072e4254a93b539475a5aa1',1,'operator&(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga883ec5e2401d4cba39d1e4a61b968d94',1,'operator&(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf31f6fafe2187bc62231e4d0af623cad',1,'operator&(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc1e6f9244edefd36feff70a5eb86150',1,'operator&(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab69568bca24e4407e2658ac08a843681',1,'operator&(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04720d9d8f413cfb21fcb97e53435911',1,'operator&(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86170e2b7b037f8d980d18f876e72c8d',1,'operator&(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0707c9dedfd86a692e37e96fe1661ca',1,'operator&(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6cf168e908a747b46770c3c49cc239',1,'operator&(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9886a421fb77d7c4b6c69fb3265e3a5b',1,'operator&(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac32cf95373924bf8cecb00934eeb13ce',1,'operator&(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac45d05b0b072454d8a1e434bc31a2622',1,'operator&(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f62603bc29e2ad5f85228039996f9f',1,'operator&(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf63f98e35a6ecd4b52e32c00aec377ce',1,'operator&(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga167cfb86156279d9446b2428dfcdf459',1,'operator&(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19d008f7753dd3651d38cf48c2fef06c',1,'operator&(const uint4 &a, uint s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0bad6c26bf52fd395038f073e09423b9',1,'std::operator&()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#aa181d58777df9e46fdd8b6cf08dd12c3',1,'std::regex_constants::operator&(syntax_option_type __a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a91f43c51d82f4484019c321d420a9fa3',1,'std::regex_constants::operator&(match_flag_type __a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gacc832712a19ae288e2b01ba85bee3d5a',1,'std::tr2::operator&()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gacc832712a19ae288e2b01ba85bee3d5a',1,'operator&()(Global Namespace)']]], - ['operator_26_26_103',['operator&&',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9daa85a8c304bfe871adc47da30a4075',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c3601d795120192cba3966eae171f10',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3bdc6d15e263a0dabfd93f5c2e4b65f',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad06b1219c0854f5f7bb80f38df9d8cb4',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga897646556f5a3a133b41494b371b484b',1,'cv::cudev::operator&&(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa883a73a52c65d1e648c2f8844352ceb',1,'cv::cudev::operator&&(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468fd922ef425cca9d9ec40fc702cc52',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2816ac7d00137b8a6631c13355bbf84d',1,'cv::cudev::operator&&(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3a1b877260a04e1c1664908d89f87c1',1,'cv::cudev::operator&&(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51ac89a7446501931038d95fca430398',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987ac6dfee9f13d1365e8741da3ea37a',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace124f27b31537a2901a0dfa2c5a52ba',1,'cv::cudev::operator&&(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508b443e9fd9a0b93d9ae46f85a64edb',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2048cae02db953f223509133d6c274da',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6e25ae76fb3499ae0e9655b6fa6c5d4',1,'cv::cudev::operator&&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc7b300e441c12d3f877fbba0f640f91',1,'cv::cudev::operator&&(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6df462ce5ffc9b3ee0fe42b1fc3bfb0f',1,'cv::cudev::operator&&(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfa8ff8614d4e00b93ee2d759819a4cb',1,'cv::cudev::operator&&(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dd173482aba8974fc0592b0c25f3c2',1,'cv::cudev::operator&&(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac76e6288a150f76f61a2824840344e7b',1,'cv::cudev::operator&&(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9be5fb383bfaf67c9bc2af53e6ae445',1,'cv::cudev::operator&&(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cee20c36d3655a18dae9c643a08db82',1,'cv::cudev::operator&&(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65a91568d8a8069dbd33c5f48ef8e691',1,'cv::cudev::operator&&(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac51b458c5da2918473fee75cb6e10955',1,'cv::cudev::operator&&(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56cf2aa63abdf862d31098458753edbb',1,'cv::cudev::operator&&(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dc1d206c05395102ddc5a1a287461e',1,'cv::cudev::operator&&(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990451138951363139dd592adce0ff78',1,'cv::cudev::operator&&(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae22e605f6aff9ef0a408e0caa81925ec',1,'cv::cudev::operator&&(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc48e8ac73e455ef8bd4b6f830280f09',1,'cv::cudev::operator&&(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a58600dc51ddd5a9609e2ebd5e2fbca',1,'cv::cudev::operator&&(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e50d6f24de8bf739a28d4f25dcc791b',1,'cv::cudev::operator&&(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa394cdb2ec6fa3211a4a76c8dd2d849e',1,'cv::cudev::operator&&(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7c5a779467e224a84de95a4cf906ae4',1,'cv::cudev::operator&&(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9a6d566256f6915d183f3a8ac8b85ba',1,'cv::cudev::operator&&(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff4f4526f76a68ac06eadc1b0a6be0c',1,'cv::cudev::operator&&(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a9ddd3b6a9e3f208a416bed9990c4e',1,'cv::cudev::operator&&(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755ae4826d5870d832393255b0922921',1,'cv::cudev::operator&&(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ba3e08f2b0c31afc32421751f1f80d',1,'cv::cudev::operator&&(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f917aa69f90085189ec9e06612bfa07',1,'cv::cudev::operator&&(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7916e11ea81ef8251fe45d086c96be20',1,'cv::cudev::operator&&(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b05c87a1d20f8b880ab6cbda2db9bd3',1,'cv::cudev::operator&&(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d8edae6372de657170a6d8503e50546',1,'cv::cudev::operator&&(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga597ef8e3f532caf8cf102750203625dc',1,'cv::cudev::operator&&(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dab250b0b130cd0128d02fec06b4842',1,'cv::cudev::operator&&(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c9e483c92927b8a6ebede43d4413a1',1,'cv::cudev::operator&&(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76c52d8fb9195ffbc8e724038305864f',1,'cv::cudev::operator&&(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf943568be0acae96b5b025b73efec7fb',1,'cv::cudev::operator&&(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5eba7700c8b81b388425b3d0b138c6f',1,'cv::cudev::operator&&(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac16ec172d052e95bbf324345dac02567',1,'cv::cudev::operator&&(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0885c4984c4251641df3bc3f2720ac90',1,'cv::cudev::operator&&(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a132cd81a7e17cdb05f15ed4d04c810',1,'cv::cudev::operator&&(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga784e168129bc4fce6b3f7c17ed5fc70d',1,'cv::cudev::operator&&(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdfe6638006d040dd4c446f2e0a2394',1,'cv::cudev::operator&&(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6376582bf0339f0b9c9388fadc8d8ca4',1,'cv::cudev::operator&&(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafce02da16b670515cf35ac56ef70f550',1,'cv::cudev::operator&&(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga173fe35e9054cb5a39aa6e8880866cda',1,'cv::cudev::operator&&(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e115f94ba7670c47892d29058840e15',1,'cv::cudev::operator&&(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e28550c974cc909cb44d798988cce12',1,'cv::cudev::operator&&(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cc212c7d51a10bcbd8b7f0156160fe3',1,'cv::cudev::operator&&(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec57a07d4d17363ae5e7e387fcea30a0',1,'cv::cudev::operator&&(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f3a4fb3fa1532375e8890053394ab03',1,'cv::cudev::operator&&(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3986bd1d079a19f0f4ec3255a74c748',1,'cv::cudev::operator&&(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f3bd5cbe1e0bf123190c0a600eed871',1,'cv::cudev::operator&&(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9456d12d1542746d8289926ca17494c2',1,'cv::cudev::operator&&(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a553dd9208cba98dba26d25074ea3fc',1,'cv::cudev::operator&&(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9752fe7958a740cea43e4f5bd4f1a15',1,'cv::cudev::operator&&(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaece716a600686f5b9781ec870ea442f0',1,'cv::cudev::operator&&(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4573fd86b5ee0040383fd285235a066d',1,'cv::cudev::operator&&(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75403ae82171c1a3eae6dbeefb12dc02',1,'cv::cudev::operator&&(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31c1bf92bb175a9fa8596c438db86014',1,'cv::cudev::operator&&(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74734139f4f10325d11fe6a9085279e1',1,'cv::cudev::operator&&(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25395032ad06d8e8c445079cb8e9aa42',1,'cv::cudev::operator&&(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6a649ac42b67feb71003beddbacd7f0',1,'cv::cudev::operator&&(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31766171823163be81c9b812569822e6',1,'cv::cudev::operator&&(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2a9aee1a3645f4251ce647c2927d452',1,'cv::cudev::operator&&(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada168ab6107bd0ccfd2bd501f3e277f3',1,'cv::cudev::operator&&(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b4509b995583bc214680c6327af30e0',1,'cv::cudev::operator&&(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8006f3728e9e0df5a7f72765d207b406',1,'cv::cudev::operator&&(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30b7bb6d73291c7482998899eb14d144',1,'cv::cudev::operator&&(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ddc4cbc632339a238fb6d9ed1b9a5ca',1,'cv::cudev::operator&&(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59c31536e15ee1bfcc9e0a2a2babbb44',1,'cv::cudev::operator&&(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4122355804f4d7068d2c3e727f060c69',1,'cv::cudev::operator&&(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56ceb64916924c2b210aeeeea43cb93',1,'cv::cudev::operator&&(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee9ad5547e1a27092cd79622c56ac2b7',1,'cv::cudev::operator&&(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a48ccd60d6b596798654adec10cbda0',1,'cv::cudev::operator&&(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9f44a6c26c30d6a39bc45a623dc6a3',1,'cv::cudev::operator&&(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cb948715ea292618e5672820cebed45',1,'cv::cudev::operator&&(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae559d6cf14a6c96295a07c18a2321b33',1,'cv::cudev::operator&&(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8344d3ce2cc4c18da8df795fad1b52dc',1,'cv::cudev::operator&&(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6253898eb552c062075101942a691a7d',1,'cv::cudev::operator&&(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea4896818580da7de435628d403ce426',1,'cv::cudev::operator&&(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31e5d68382677b0c792f7fa1e545dff8',1,'cv::cudev::operator&&(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18c7b7f2c8ebb8b829ae0bd902548e58',1,'cv::cudev::operator&&(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga944653cf7179a84fc232c65418c805f7',1,'cv::cudev::operator&&(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d7df31c53c8e4dc9e0cadc7af19c732',1,'cv::cudev::operator&&(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0651016efcb1cdcac924fb59ac451c7e',1,'cv::cudev::operator&&(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c62e689f10955a1f4befb6fee373e8',1,'cv::cudev::operator&&(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d63e056e39e0fb89da997f16611a635',1,'cv::cudev::operator&&(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6744338561d677971b9c536a5065ed37',1,'cv::cudev::operator&&(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee44cddc9a95fb7d5fd14c3a904ac916',1,'cv::cudev::operator&&(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9a63465a3fce79c26a75e054f67b0c8',1,'cv::cudev::operator&&(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1418091ec7fc32cf9df83c3b33157652',1,'cv::cudev::operator&&(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f8e32c315622cd29f644906a8fb699c',1,'cv::cudev::operator&&(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b14278109d0129e03a1c122f34a400b',1,'cv::cudev::operator&&(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad24b233b709002378ddab84ebab7b8c1',1,'cv::cudev::operator&&(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7881e75bb7e5519030f9c27966e4bbc9',1,'cv::cudev::operator&&(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab59a4f1aaebaeb0ab30d236cd90ea438',1,'cv::cudev::operator&&(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16e626f8b9952b0a82fd931686d9e98a',1,'cv::cudev::operator&&(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad6bb786a45b9412453e93239972519',1,'cv::cudev::operator&&(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga918585aac4816c3ce968d179cfcfb6c9',1,'cv::cudev::operator&&(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08df2d9887291e206d3f0f42a313a220',1,'cv::cudev::operator&&(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga543d7d06fea6a02e66ecef2710cb7608',1,'cv::cudev::operator&&(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84ee73980b0845219731857a6ea350c1',1,'cv::cudev::operator&&(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ffc399abd2fb9fc96bb9700e5d5ebd',1,'cv::cudev::operator&&(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6287e06b541f138ea8c3ff9744299b2a',1,'cv::cudev::operator&&(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad006a6b3d0f83b95d337925f808bb9a0',1,'cv::cudev::operator&&(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5b87c6df19abe0807b867a8055d7210',1,'cv::cudev::operator&&(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9bf69d4894e48fe280fb7af235ee729',1,'cv::cudev::operator&&(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48663d644513466290e6c1b1467bafdb',1,'cv::cudev::operator&&(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60d7bf69aabe9bbe43a43ebc656471bd',1,'cv::cudev::operator&&(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9daa85a8c304bfe871adc47da30a4075',1,'operator&&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c3601d795120192cba3966eae171f10',1,'operator&&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3bdc6d15e263a0dabfd93f5c2e4b65f',1,'operator&&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad06b1219c0854f5f7bb80f38df9d8cb4',1,'operator&&(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga897646556f5a3a133b41494b371b484b',1,'operator&&(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa883a73a52c65d1e648c2f8844352ceb',1,'operator&&(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468fd922ef425cca9d9ec40fc702cc52',1,'operator&&(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2816ac7d00137b8a6631c13355bbf84d',1,'operator&&(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3a1b877260a04e1c1664908d89f87c1',1,'operator&&(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51ac89a7446501931038d95fca430398',1,'operator&&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987ac6dfee9f13d1365e8741da3ea37a',1,'operator&&(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace124f27b31537a2901a0dfa2c5a52ba',1,'operator&&(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508b443e9fd9a0b93d9ae46f85a64edb',1,'operator&&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2048cae02db953f223509133d6c274da',1,'operator&&(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6e25ae76fb3499ae0e9655b6fa6c5d4',1,'operator&&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc7b300e441c12d3f877fbba0f640f91',1,'operator&&(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6df462ce5ffc9b3ee0fe42b1fc3bfb0f',1,'operator&&(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfa8ff8614d4e00b93ee2d759819a4cb',1,'operator&&(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dd173482aba8974fc0592b0c25f3c2',1,'operator&&(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac76e6288a150f76f61a2824840344e7b',1,'operator&&(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9be5fb383bfaf67c9bc2af53e6ae445',1,'operator&&(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cee20c36d3655a18dae9c643a08db82',1,'operator&&(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65a91568d8a8069dbd33c5f48ef8e691',1,'operator&&(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac51b458c5da2918473fee75cb6e10955',1,'operator&&(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56cf2aa63abdf862d31098458753edbb',1,'operator&&(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dc1d206c05395102ddc5a1a287461e',1,'operator&&(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990451138951363139dd592adce0ff78',1,'operator&&(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae22e605f6aff9ef0a408e0caa81925ec',1,'operator&&(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc48e8ac73e455ef8bd4b6f830280f09',1,'operator&&(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a58600dc51ddd5a9609e2ebd5e2fbca',1,'operator&&(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e50d6f24de8bf739a28d4f25dcc791b',1,'operator&&(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa394cdb2ec6fa3211a4a76c8dd2d849e',1,'operator&&(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7c5a779467e224a84de95a4cf906ae4',1,'operator&&(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9a6d566256f6915d183f3a8ac8b85ba',1,'operator&&(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff4f4526f76a68ac06eadc1b0a6be0c',1,'operator&&(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a9ddd3b6a9e3f208a416bed9990c4e',1,'operator&&(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755ae4826d5870d832393255b0922921',1,'operator&&(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ba3e08f2b0c31afc32421751f1f80d',1,'operator&&(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f917aa69f90085189ec9e06612bfa07',1,'operator&&(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7916e11ea81ef8251fe45d086c96be20',1,'operator&&(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b05c87a1d20f8b880ab6cbda2db9bd3',1,'operator&&(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d8edae6372de657170a6d8503e50546',1,'operator&&(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga597ef8e3f532caf8cf102750203625dc',1,'operator&&(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dab250b0b130cd0128d02fec06b4842',1,'operator&&(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c9e483c92927b8a6ebede43d4413a1',1,'operator&&(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76c52d8fb9195ffbc8e724038305864f',1,'operator&&(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf943568be0acae96b5b025b73efec7fb',1,'operator&&(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5eba7700c8b81b388425b3d0b138c6f',1,'operator&&(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac16ec172d052e95bbf324345dac02567',1,'operator&&(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0885c4984c4251641df3bc3f2720ac90',1,'operator&&(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a132cd81a7e17cdb05f15ed4d04c810',1,'operator&&(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga784e168129bc4fce6b3f7c17ed5fc70d',1,'operator&&(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdfe6638006d040dd4c446f2e0a2394',1,'operator&&(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6376582bf0339f0b9c9388fadc8d8ca4',1,'operator&&(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafce02da16b670515cf35ac56ef70f550',1,'operator&&(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga173fe35e9054cb5a39aa6e8880866cda',1,'operator&&(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e115f94ba7670c47892d29058840e15',1,'operator&&(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e28550c974cc909cb44d798988cce12',1,'operator&&(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cc212c7d51a10bcbd8b7f0156160fe3',1,'operator&&(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec57a07d4d17363ae5e7e387fcea30a0',1,'operator&&(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f3a4fb3fa1532375e8890053394ab03',1,'operator&&(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3986bd1d079a19f0f4ec3255a74c748',1,'operator&&(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f3bd5cbe1e0bf123190c0a600eed871',1,'operator&&(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9456d12d1542746d8289926ca17494c2',1,'operator&&(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a553dd9208cba98dba26d25074ea3fc',1,'operator&&(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9752fe7958a740cea43e4f5bd4f1a15',1,'operator&&(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaece716a600686f5b9781ec870ea442f0',1,'operator&&(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4573fd86b5ee0040383fd285235a066d',1,'operator&&(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75403ae82171c1a3eae6dbeefb12dc02',1,'operator&&(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31c1bf92bb175a9fa8596c438db86014',1,'operator&&(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74734139f4f10325d11fe6a9085279e1',1,'operator&&(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25395032ad06d8e8c445079cb8e9aa42',1,'operator&&(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6a649ac42b67feb71003beddbacd7f0',1,'operator&&(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31766171823163be81c9b812569822e6',1,'operator&&(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2a9aee1a3645f4251ce647c2927d452',1,'operator&&(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada168ab6107bd0ccfd2bd501f3e277f3',1,'operator&&(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b4509b995583bc214680c6327af30e0',1,'operator&&(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8006f3728e9e0df5a7f72765d207b406',1,'operator&&(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30b7bb6d73291c7482998899eb14d144',1,'operator&&(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ddc4cbc632339a238fb6d9ed1b9a5ca',1,'operator&&(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59c31536e15ee1bfcc9e0a2a2babbb44',1,'operator&&(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4122355804f4d7068d2c3e727f060c69',1,'operator&&(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56ceb64916924c2b210aeeeea43cb93',1,'operator&&(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee9ad5547e1a27092cd79622c56ac2b7',1,'operator&&(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a48ccd60d6b596798654adec10cbda0',1,'operator&&(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9f44a6c26c30d6a39bc45a623dc6a3',1,'operator&&(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cb948715ea292618e5672820cebed45',1,'operator&&(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae559d6cf14a6c96295a07c18a2321b33',1,'operator&&(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8344d3ce2cc4c18da8df795fad1b52dc',1,'operator&&(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6253898eb552c062075101942a691a7d',1,'operator&&(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea4896818580da7de435628d403ce426',1,'operator&&(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31e5d68382677b0c792f7fa1e545dff8',1,'operator&&(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18c7b7f2c8ebb8b829ae0bd902548e58',1,'operator&&(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga944653cf7179a84fc232c65418c805f7',1,'operator&&(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d7df31c53c8e4dc9e0cadc7af19c732',1,'operator&&(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0651016efcb1cdcac924fb59ac451c7e',1,'operator&&(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c62e689f10955a1f4befb6fee373e8',1,'operator&&(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d63e056e39e0fb89da997f16611a635',1,'operator&&(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6744338561d677971b9c536a5065ed37',1,'operator&&(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee44cddc9a95fb7d5fd14c3a904ac916',1,'operator&&(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9a63465a3fce79c26a75e054f67b0c8',1,'operator&&(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1418091ec7fc32cf9df83c3b33157652',1,'operator&&(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f8e32c315622cd29f644906a8fb699c',1,'operator&&(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b14278109d0129e03a1c122f34a400b',1,'operator&&(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad24b233b709002378ddab84ebab7b8c1',1,'operator&&(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7881e75bb7e5519030f9c27966e4bbc9',1,'operator&&(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab59a4f1aaebaeb0ab30d236cd90ea438',1,'operator&&(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16e626f8b9952b0a82fd931686d9e98a',1,'operator&&(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad6bb786a45b9412453e93239972519',1,'operator&&(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga918585aac4816c3ce968d179cfcfb6c9',1,'operator&&(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08df2d9887291e206d3f0f42a313a220',1,'operator&&(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga543d7d06fea6a02e66ecef2710cb7608',1,'operator&&(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84ee73980b0845219731857a6ea350c1',1,'operator&&(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ffc399abd2fb9fc96bb9700e5d5ebd',1,'operator&&(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6287e06b541f138ea8c3ff9744299b2a',1,'operator&&(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad006a6b3d0f83b95d337925f808bb9a0',1,'operator&&(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5b87c6df19abe0807b867a8055d7210',1,'operator&&(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9bf69d4894e48fe280fb7af235ee729',1,'operator&&(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48663d644513466290e6c1b1467bafdb',1,'operator&&(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60d7bf69aabe9bbe43a43ebc656471bd',1,'operator&&(double s, const double2 &b)(Global Namespace)']]], - ['operator_26_3d_104',['operator&=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aaeeeb77b0bef34eb4eacb3905e09a561',1,'std::bitset::operator&=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aaeeeb77b0bef34eb4eacb3905e09a561',1,'std::bitset::operator&=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaca009c69acad92ea0f2244082487b32b',1,'std::gslice_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9a195965bc454b815b4035618de3f5ba',1,'std::indirect_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga243e78b1748d74ed3d4be27c8839fb87',1,'std::mask_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc4123a878dbaee0b0e8dea7aeb7216c',1,'std::slice_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae775a70aa50343f7e0d12bec75dcdd2b',1,'std::tr2::dynamic_bitset::operator&=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab623bb2bba98884ae7c3eccd227d5459',1,'std::tr2::dynamic_bitset::operator&=(dynamic_bitset &&__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae775a70aa50343f7e0d12bec75dcdd2b',1,'std::tr2::dynamic_bitset::operator&=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab623bb2bba98884ae7c3eccd227d5459',1,'std::tr2::dynamic_bitset::operator&=(dynamic_bitset &&__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6eacabfbf6099e64331966308185f957',1,'std::valarray::operator&=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafc4fe2eb569b9bca46e799f3ecb0609c',1,'std::valarray::operator&=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6eacabfbf6099e64331966308185f957',1,'valarray< size_t >::operator&=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafc4fe2eb569b9bca46e799f3ecb0609c',1,'valarray< size_t >::operator&=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1c36b9548296f20d3382808c82122ca3',1,'cv::operator&=()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#adaba058bb9999abb04506b319aff5011',1,'cv::gapi::own::operator&=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1c36b9548296f20d3382808c82122ca3',1,'operator&=()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a0ac5601f07c5581e7cc3efd6ce6a9d4f',1,'std::regex_constants::operator&=(syntax_option_type &__a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#adf8b32ecec86f9328d9e77ea918d5bd7',1,'std::regex_constants::operator&=(match_flag_type &__a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaca009c69acad92ea0f2244082487b32b',1,'operator&=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6eacabfbf6099e64331966308185f957',1,'operator&=(const _Tp &)(Global Namespace)']]], - ['operator_28_29_105',['operator()',['https://docs.opencv.org/4.2.0/da/d32/structcv_1_1cudev_1_1abs__func.html#a94901ba987a4b13f76d6c512ff67630f',1,'cv::cudev::abs_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/d17/structcv_1_1cudev_1_1abs__func_3_01double_01_4.html#a09324ee98e693e096ffbf16186d54406',1,'cv::cudev::abs_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d75/structcv_1_1cudev_1_1abs__func_3_01float_01_4.html#a61ef7062be465ef121b724f7c612e100',1,'cv::cudev::abs_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d3/dc9/structcv_1_1cudev_1_1abs__func_3_01schar_01_4.html#a33a00f9fd47140d763c362d2d8754ef5',1,'cv::cudev::abs_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d2b/structcv_1_1cudev_1_1abs__func_3_01short_01_4.html#ab273409438d23ecf6a7deee0a1ceb338',1,'cv::cudev::abs_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d6e/structcv_1_1cudev_1_1abs__func_3_01uchar_01_4.html#a087883df9c5e8aa99a6e686a2a42ee30',1,'cv::cudev::abs_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d98/structcv_1_1cudev_1_1abs__func_3_01uint_01_4.html#a6194e5eba6a05ab9fef48ef29855ad22',1,'cv::cudev::abs_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/da7/structcv_1_1cudev_1_1abs__func_3_01ushort_01_4.html#a230f31a23cac7d7b75e8f1b8b32ad1dc',1,'cv::cudev::abs_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/da1/structcv_1_1cudev_1_1absdiff__func.html#ab501011fd7f3950a7db1bff0e6c4f739',1,'cv::cudev::absdiff_func::operator()()'],['https://docs.opencv.org/4.2.0/de/dae/structcv_1_1cudev_1_1acos__func.html#a00573ba47210264bc9812c7e2fbb1676',1,'cv::cudev::acos_func::operator()()'],['https://docs.opencv.org/4.2.0/d0/d62/structcv_1_1cudev_1_1acos__func_3_01double_01_4.html#a35dd825ad75c47ace1929b2b478705cb',1,'cv::cudev::acos_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd0/structcv_1_1cudev_1_1acos__func_3_01float_01_4.html#a72e654a25abffc81ac465c0b62f751ab',1,'cv::cudev::acos_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d4/dc1/structcv_1_1cudev_1_1acos__func_3_01schar_01_4.html#a751cd34b926ea535d1c4ae85115b3ad3',1,'cv::cudev::acos_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d80/structcv_1_1cudev_1_1acos__func_3_01short_01_4.html#ab8a75a695c451fee16cf582bb37be3a7',1,'cv::cudev::acos_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1acos__func_3_01uchar_01_4.html#a41864404742e2b57a5d61bfaedc6930b',1,'cv::cudev::acos_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dc0/structcv_1_1cudev_1_1acos__func_3_01uint_01_4.html#af21480a7802d4fcdb548d815d2732108',1,'cv::cudev::acos_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/de/d57/structcv_1_1cudev_1_1acos__func_3_01ushort_01_4.html#ace440e4c06446bf686bdf56aaa61e370',1,'cv::cudev::acos_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/da/d97/structcv_1_1cudev_1_1acosh__func.html#a6902cdcdfeff1b7173d4cfffd32d7e03',1,'cv::cudev::acosh_func::operator()()'],['https://docs.opencv.org/4.2.0/d6/de9/structcv_1_1cudev_1_1acosh__func_3_01double_01_4.html#adcdbcc1362f625ca203505bc291a8a3c',1,'cv::cudev::acosh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/de/d89/structcv_1_1cudev_1_1acosh__func_3_01float_01_4.html#a8982e72923a845633808910076483761',1,'cv::cudev::acosh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d52/structcv_1_1cudev_1_1acosh__func_3_01schar_01_4.html#ae815dc363c798f86c639fdbee64d53dc',1,'cv::cudev::acosh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d61/structcv_1_1cudev_1_1acosh__func_3_01short_01_4.html#a7591548bc937a985b6beb8f616ed3eed',1,'cv::cudev::acosh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d17/structcv_1_1cudev_1_1acosh__func_3_01uchar_01_4.html#ab9166b320e5284bbc93311576451082f',1,'cv::cudev::acosh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/de/d8f/structcv_1_1cudev_1_1acosh__func_3_01uint_01_4.html#ae1379c0c1004182761438b8759767f55',1,'cv::cudev::acosh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/db8/structcv_1_1cudev_1_1acosh__func_3_01ushort_01_4.html#aa7121ef1b36d0b4308d6fb954af64194',1,'cv::cudev::acosh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d2a/structcv_1_1cudev_1_1AffineMapPtr.html#a4445dd8e26b3ab12dd94b0a03459f8c7',1,'cv::cudev::AffineMapPtr::operator()()'],['https://docs.opencv.org/4.2.0/d9/dee/structcv_1_1cudev_1_1asin__func.html#ad0dadefec255a3fab08b7b6951976147',1,'cv::cudev::asin_func::operator()()'],['https://docs.opencv.org/4.2.0/d6/d59/structcv_1_1cudev_1_1asin__func_3_01double_01_4.html#ae6b289475377426443000524d7c90085',1,'cv::cudev::asin_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d96/structcv_1_1cudev_1_1asin__func_3_01float_01_4.html#a96523634a121003c18ef94ff4034e750',1,'cv::cudev::asin_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d9/da3/structcv_1_1cudev_1_1asin__func_3_01schar_01_4.html#a0894abd85f1e7283ec0d7987e83870a4',1,'cv::cudev::asin_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d16/structcv_1_1cudev_1_1asin__func_3_01short_01_4.html#ac71145c2171d2ac723c9ea4bc122fd2d',1,'cv::cudev::asin_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/da/d71/structcv_1_1cudev_1_1asin__func_3_01uchar_01_4.html#a6de9805df271a327d045d0423d9b0b7f',1,'cv::cudev::asin_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d65/structcv_1_1cudev_1_1asin__func_3_01uint_01_4.html#a67ae0549ed7d2d8bfcf3f12fbe27f0d9',1,'cv::cudev::asin_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d46/structcv_1_1cudev_1_1asin__func_3_01ushort_01_4.html#ae72849100ba9499ef28b6474b147c639',1,'cv::cudev::asin_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d43/structcv_1_1cudev_1_1asinh__func.html#a3dfa1b292a19d188f40bfe6023044c77',1,'cv::cudev::asinh_func::operator()()'],['https://docs.opencv.org/4.2.0/d7/da8/structcv_1_1cudev_1_1asinh__func_3_01double_01_4.html#ae1635d4b05cded16135c4fdf03708e55',1,'cv::cudev::asinh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d1c/structcv_1_1cudev_1_1asinh__func_3_01float_01_4.html#a854f649e9681f1e6f1c5ae814e53f729',1,'cv::cudev::asinh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/db/db5/structcv_1_1cudev_1_1asinh__func_3_01schar_01_4.html#a6884224d8c6774ded501395c72fbe5c2',1,'cv::cudev::asinh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/df/da7/structcv_1_1cudev_1_1asinh__func_3_01short_01_4.html#aef45a37522498495bf0a4f6ccb55f1cf',1,'cv::cudev::asinh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1cudev_1_1asinh__func_3_01uchar_01_4.html#abe9fca6c5fc501aebd16b35ccdef9dcb',1,'cv::cudev::asinh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d27/structcv_1_1cudev_1_1asinh__func_3_01uint_01_4.html#ae8758ca4e6f926650c902e84e762a2a3',1,'cv::cudev::asinh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dc2/structcv_1_1cudev_1_1asinh__func_3_01ushort_01_4.html#a187311528ee4b3a4be24935b2a0a0c70',1,'cv::cudev::asinh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d8e/structcv_1_1cudev_1_1atan2__func.html#a11d690fd0a2f0d1169808d70e768c7b9',1,'cv::cudev::atan2_func::operator()()'],['https://docs.opencv.org/4.2.0/d8/d15/structcv_1_1cudev_1_1atan2__func_3_01double_01_4.html#ab78ab22ad26665bd7c9832006b3f39b0',1,'cv::cudev::atan2_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d0/df1/structcv_1_1cudev_1_1atan2__func_3_01float_01_4.html#a90ec967495f0b7d8067ca7a8256b0dfe',1,'cv::cudev::atan2_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/da/da9/structcv_1_1cudev_1_1atan2__func_3_01schar_01_4.html#abbf914a1e06e67bbd24d10519212b0b4',1,'cv::cudev::atan2_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d9/dc9/structcv_1_1cudev_1_1atan2__func_3_01short_01_4.html#a2a2a614f5878ff865689740cb2068161',1,'cv::cudev::atan2_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d3/d1d/structcv_1_1cudev_1_1atan2__func_3_01uchar_01_4.html#a13984771ed43545e79b89929980d1e12',1,'cv::cudev::atan2_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d4a/structcv_1_1cudev_1_1atan2__func_3_01uint_01_4.html#a86eb842a0331b8d78aaf9d549f7f9e60',1,'cv::cudev::atan2_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d3/d2f/structcv_1_1cudev_1_1atan2__func_3_01ushort_01_4.html#aac55a6e3c6029d3e78c55621ba4da3b3',1,'cv::cudev::atan2_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/df/d91/structcv_1_1cudev_1_1atan__func.html#aaf59131d17cd6f8e0460b27ab2c3a592',1,'cv::cudev::atan_func::operator()()'],['https://docs.opencv.org/4.2.0/d4/d8e/structcv_1_1cudev_1_1atan__func_3_01double_01_4.html#a7a4e8cda92da1627965c13cf5a7e5bd6',1,'cv::cudev::atan_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dc1/structcv_1_1cudev_1_1atan__func_3_01float_01_4.html#a9dd06696f21326f73219a9676da4cadb',1,'cv::cudev::atan_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d4a/structcv_1_1cudev_1_1atan__func_3_01schar_01_4.html#a2ace3f94c175ba447f5ff3491bbc0f4a',1,'cv::cudev::atan_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d20/structcv_1_1cudev_1_1atan__func_3_01short_01_4.html#a94ca8f0722bdd8644dc260d770717c97',1,'cv::cudev::atan_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/dd/dce/structcv_1_1cudev_1_1atan__func_3_01uchar_01_4.html#afc69d55cb3f353d36edb4a009e6a489b',1,'cv::cudev::atan_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/de6/structcv_1_1cudev_1_1atan__func_3_01uint_01_4.html#a1d4d42bb9b4aa669b985bbbcf2279fd7',1,'cv::cudev::atan_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d1/da0/structcv_1_1cudev_1_1atan__func_3_01ushort_01_4.html#a5ec7b0f0f0ec3e89c8647d985de6a508',1,'cv::cudev::atan_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1cudev_1_1atanh__func.html#a7edb319d3025314f194ed524445ecbb4',1,'cv::cudev::atanh_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/d41/structcv_1_1cudev_1_1atanh__func_3_01double_01_4.html#aa8e199a08e43ec0d5171a69d7338d9d2',1,'cv::cudev::atanh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d2d/structcv_1_1cudev_1_1atanh__func_3_01float_01_4.html#a153da89a9a6d590316ad349f95427817',1,'cv::cudev::atanh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd6/structcv_1_1cudev_1_1atanh__func_3_01schar_01_4.html#acc9242ab80f0ab4475bb28138cc36707',1,'cv::cudev::atanh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1cudev_1_1atanh__func_3_01short_01_4.html#a3bbe7f572ee9bd3a177b840e62d91f7e',1,'cv::cudev::atanh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d90/structcv_1_1cudev_1_1atanh__func_3_01uchar_01_4.html#a1bc8a25394326dca443aafe1dacd79b2',1,'cv::cudev::atanh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/ddc/structcv_1_1cudev_1_1atanh__func_3_01uint_01_4.html#abab90e89b20be773fa2ec8b9c117bdce',1,'cv::cudev::atanh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dd0/structcv_1_1cudev_1_1atanh__func_3_01ushort_01_4.html#a405304579640281e82b10a1b1a7dce8b',1,'cv::cudev::atanh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1detail_1_1BestOf2NearestRangeMatcher.html#a66deb1783f81d32e61e64533aa03e103',1,'cv::detail::BestOf2NearestRangeMatcher::operator()()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#aceb00c1f30edf4b763d510e88a2bd0e1',1,'cv::line_descriptor::BinaryDescriptor::operator()()'],['https://docs.opencv.org/4.2.0/d1/d81/structcv_1_1cudev_1_1BinaryNegate.html#a36756888244e5ef22f86fd4c49fc7a15',1,'cv::cudev::BinaryNegate::operator()()'],['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#ae37dde0385c22b65a264ab65c21f39b9',1,'cv::cudev::BinaryTransformPtr::operator()()'],['https://docs.opencv.org/4.2.0/dc/da3/structcv_1_1cudev_1_1BinaryTupleAdapter.html#a991d05c3c6bdc3cad44d5c06bdb98a51',1,'cv::cudev::BinaryTupleAdapter::operator()()'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1Binder1st.html#a961f08f309d5aee4e0aeaab104903b80',1,'cv::cudev::Binder1st::operator()()'],['https://docs.opencv.org/4.2.0/d6/db4/structcv_1_1cudev_1_1Binder2nd.html#ad0467cfe7ff80497c4d75dfe802bfc6d',1,'cv::cudev::Binder2nd::operator()()'],['https://docs.opencv.org/4.2.0/d9/de7/structcv_1_1cudev_1_1bit__and.html#af7f2f2bbf763662ba9f6ad6d715325b2',1,'cv::cudev::bit_and::operator()()'],['https://docs.opencv.org/4.2.0/d3/d65/structcv_1_1cudev_1_1bit__lshift.html#a319adce84f53f86c628d35bbbf4a6a8f',1,'cv::cudev::bit_lshift::operator()()'],['https://docs.opencv.org/4.2.0/d0/d8a/structcv_1_1cudev_1_1bit__not.html#a54dd18d632ab34ca40cfa34051c6837b',1,'cv::cudev::bit_not::operator()()'],['https://docs.opencv.org/4.2.0/dd/d1c/structcv_1_1cudev_1_1bit__or.html#a9f4238b0c69f7b11dceade45b5e725e7',1,'cv::cudev::bit_or::operator()()'],['https://docs.opencv.org/4.2.0/d4/d2a/structcv_1_1cudev_1_1bit__rshift.html#ab4777501448c008710af761884857af7',1,'cv::cudev::bit_rshift::operator()()'],['https://docs.opencv.org/4.2.0/df/d44/structcv_1_1cudev_1_1bit__xor.html#aae72022cafd71a432dcd395a79ea93c0',1,'cv::cudev::bit_xor::operator()()'],['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#a9d17dbeddaa46c18fa0fa4e4a9e75db3',1,'cv::cudev::BrdBase::operator()()'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#a848eeec7df49f12d767c8460e7d571b4',1,'cv::cudev::BrdConstant::operator()()'],['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html#af6aaa70f1767009aca371d0a195a897f',1,'cv::stereo::CensusKernel::operator()()'],['https://docs.opencv.org/4.2.0/d4/d5b/classcv_1_1stereo_1_1CombinedDescriptor.html#ab5cf7d0c8c4072e3284fc6d140f8675c',1,'cv::stereo::CombinedDescriptor::operator()()'],['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#a59488b025a29244f32bb13b8e88ca9c8',1,'cv::cudev::CommonAreaInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d5/db7/structcv_1_1cudev_1_1ConstantPtr.html#ab9fdee7febaee40d0a8d84dc03e683f6',1,'cv::cudev::ConstantPtr::operator()()'],['https://docs.opencv.org/4.2.0/d6/dfb/structcv_1_1cudev_1_1cos__func.html#a988f8089a8b8d195a2ff3bd00b83d46f',1,'cv::cudev::cos_func::operator()()'],['https://docs.opencv.org/4.2.0/db/d23/structcv_1_1cudev_1_1cos__func_3_01double_01_4.html#aaf9cfdadc2fdf132ce1c6fd1bc4d23c7',1,'cv::cudev::cos_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d7a/structcv_1_1cudev_1_1cos__func_3_01float_01_4.html#aabb752915736cacff3b15eb91a1cc4c5',1,'cv::cudev::cos_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d25/structcv_1_1cudev_1_1cos__func_3_01schar_01_4.html#a1e26eec7e6cf6e3cf0ddfcd4d150f10e',1,'cv::cudev::cos_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d03/structcv_1_1cudev_1_1cos__func_3_01short_01_4.html#a97f88f391e8eccee42251572d6917d39',1,'cv::cudev::cos_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d3d/structcv_1_1cudev_1_1cos__func_3_01uchar_01_4.html#a693d78041e8f0eb86a521d7ea868aaa6',1,'cv::cudev::cos_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/da/dc1/structcv_1_1cudev_1_1cos__func_3_01uint_01_4.html#a2fe66a37f8017659d4528d44361536d8',1,'cv::cudev::cos_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/df/d35/structcv_1_1cudev_1_1cos__func_3_01ushort_01_4.html#ae58914f83f44a50534220d0496c6f134',1,'cv::cudev::cos_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d8a/structcv_1_1cudev_1_1cosh__func.html#a2762fccc8bcb7c73e5029fb2ca79e9b0',1,'cv::cudev::cosh_func::operator()()'],['https://docs.opencv.org/4.2.0/d5/d3a/structcv_1_1cudev_1_1cosh__func_3_01double_01_4.html#a1a46775b2bbfbad92506fb451ee1c79d',1,'cv::cudev::cosh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/db/d8d/structcv_1_1cudev_1_1cosh__func_3_01float_01_4.html#a1ee29ef52dc2cf4be6d5e6270503bea5',1,'cv::cudev::cosh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/df/dd8/structcv_1_1cudev_1_1cosh__func_3_01schar_01_4.html#a7f79b5591445191cb72512e705306d72',1,'cv::cudev::cosh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d8a/structcv_1_1cudev_1_1cosh__func_3_01short_01_4.html#a73e6537c788b836c602d48c0dbf79e38',1,'cv::cudev::cosh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/de/d73/structcv_1_1cudev_1_1cosh__func_3_01uchar_01_4.html#ab4369c5946fe73e32b0eec7f6b77ad75',1,'cv::cudev::cosh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/ddd/structcv_1_1cudev_1_1cosh__func_3_01uint_01_4.html#a43b76700e20129190cc77111c02e53e4',1,'cv::cudev::cosh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd3/structcv_1_1cudev_1_1cosh__func_3_01ushort_01_4.html#a0171124ee451386c0d600734bd840401',1,'cv::cudev::cosh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1CubicInterPtr.html#ab39bee06ee1a2be6a2e38a7d369a716f',1,'cv::cudev::CubicInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#ab5bd6ed0b55f60a2c96b18824f7438dd',1,'cv::CvFeatureEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#aa58bba803ef918036facf78ca50c403c',1,'cv::CvHaarEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga68c6b644dd17b10637cf74117c44e35e',1,'cv::CvHOGEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#a838cd13385f89f2cda2643857d1f34b5',1,'cv::CvLBPEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/d0/d90/structcv_1_1DefaultDeleter_3_01CvCapture_01_4.html#a36b7e1f33f49b098f807f8581b1473a7',1,'cv::DefaultDeleter< CvCapture >::operator()()'],['https://docs.opencv.org/4.2.0/d9/ddf/structcv_1_1DefaultDeleter_3_01CvHaarClassifierCascade_01_4.html#a44656fba99887584e8bc88775dc4888a',1,'cv::DefaultDeleter< CvHaarClassifierCascade >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d37/structcv_1_1DefaultDeleter_3_01CvVideoWriter_01_4.html#a28a310125686255f0149c04ce70ea48e',1,'cv::DefaultDeleter< CvVideoWriter >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#ab006210fdd363a9b0c42f5c11433398d',1,'cv::rgbd::DepthCleaner::operator()()'],['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1cudev_1_1DerivXPtr.html#af9c609af8dbdb0ce6db7e5a9020ec9c0',1,'cv::cudev::DerivXPtr::operator()()'],['https://docs.opencv.org/4.2.0/dc/d51/structcv_1_1cudev_1_1DerivYPtr.html#a1ae2a1e12cc4916fe99f0330eaeb61fd',1,'cv::cudev::DerivYPtr::operator()()'],['https://docs.opencv.org/4.2.0/d3/d97/structcv_1_1cudev_1_1direction__func.html#a2155dbec5fdc65714b561ce94620691a',1,'cv::cudev::direction_func::operator()()'],['https://docs.opencv.org/4.2.0/de/d2a/structcv_1_1cudev_1_1divides.html#a1cd06b89048d107490992a1531fd2a34',1,'cv::cudev::divides::operator()()'],['https://docs.opencv.org/4.2.0/d2/dfd/structcv_1_1cudev_1_1equal__to.html#aa8931c7ed8ea7e2604c38b704b9dfb82',1,'cv::cudev::equal_to::operator()()'],['https://docs.opencv.org/4.2.0/df/d15/classcv_1_1detail_1_1Estimator.html#a0924447fc99df3360b6f005a7c0aa437',1,'cv::detail::Estimator::operator()()'],['https://docs.opencv.org/4.2.0/dc/d8b/structcv_1_1cudev_1_1exp10__func.html#a071ded47294be622de0150f258efd229',1,'cv::cudev::exp10_func::operator()()'],['https://docs.opencv.org/4.2.0/d0/d66/structcv_1_1cudev_1_1exp10__func_3_01double_01_4.html#a626097f0778f1a40babc5517ddb8153a',1,'cv::cudev::exp10_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d78/structcv_1_1cudev_1_1exp10__func_3_01float_01_4.html#afa1c84f89716f836ef03262a078fcdab',1,'cv::cudev::exp10_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dde/structcv_1_1cudev_1_1exp10__func_3_01schar_01_4.html#af0f0403c9cd63a22d8f38071b47485ab',1,'cv::cudev::exp10_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1exp10__func_3_01short_01_4.html#a3ec1f45ae0cdb736f23b16925812d758',1,'cv::cudev::exp10_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d1/ddd/structcv_1_1cudev_1_1exp10__func_3_01uchar_01_4.html#aaccfbfbcf2c5636b4ebcffb40b744427',1,'cv::cudev::exp10_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/dc3/structcv_1_1cudev_1_1exp10__func_3_01uint_01_4.html#aef6b50b90e3757e58b6cd47fd83eaeff',1,'cv::cudev::exp10_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d4/da4/structcv_1_1cudev_1_1exp10__func_3_01ushort_01_4.html#a2432a747a7d34541301142a46460a7e2',1,'cv::cudev::exp10_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/dd9/structcv_1_1cudev_1_1exp2__func.html#a7a72f8aa55099dd88aa51a6e2bf51730',1,'cv::cudev::exp2_func::operator()()'],['https://docs.opencv.org/4.2.0/d8/d9b/structcv_1_1cudev_1_1exp2__func_3_01double_01_4.html#aa8b8ebaa15b369605febaf2943a48534',1,'cv::cudev::exp2_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dc7/structcv_1_1cudev_1_1exp2__func_3_01float_01_4.html#a76a28168041a40040a59dbe5fcf80ede',1,'cv::cudev::exp2_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/de/da5/structcv_1_1cudev_1_1exp2__func_3_01schar_01_4.html#ab6cd4172be5a97a114e658ee7d8e8d94',1,'cv::cudev::exp2_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/da/d29/structcv_1_1cudev_1_1exp2__func_3_01short_01_4.html#a802f2e62fad66e331f08ed2d50ae420f',1,'cv::cudev::exp2_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d8b/structcv_1_1cudev_1_1exp2__func_3_01uchar_01_4.html#ad1357ddfd7831d00bf1716a740a10b7e',1,'cv::cudev::exp2_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/dc/dd4/structcv_1_1cudev_1_1exp2__func_3_01uint_01_4.html#afba60094be1fee3c426c31fe0c028aea',1,'cv::cudev::exp2_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d30/structcv_1_1cudev_1_1exp2__func_3_01ushort_01_4.html#acd9f9bdf9f2f21c3e4ddda350e62026c',1,'cv::cudev::exp2_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d73/structcv_1_1cudev_1_1exp__func.html#ab52d8176579e6d655d820a20360dc305',1,'cv::cudev::exp_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/db1/structcv_1_1cudev_1_1exp__func_3_01double_01_4.html#ad391b31dd35af417fe08dc8761676b1d',1,'cv::cudev::exp_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/df/dba/structcv_1_1cudev_1_1exp__func_3_01float_01_4.html#adc085ebcc030437fec9cc33766e62b45',1,'cv::cudev::exp_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d33/structcv_1_1cudev_1_1exp__func_3_01schar_01_4.html#ad3a33474b50895c9ea0de63bcc01bd31',1,'cv::cudev::exp_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d67/structcv_1_1cudev_1_1exp__func_3_01short_01_4.html#a537df0eeb7a971b7196baf6b1fbe8b46',1,'cv::cudev::exp_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d9/de4/structcv_1_1cudev_1_1exp__func_3_01uchar_01_4.html#aba3778efd452fe016b2551ae25a9e0bd',1,'cv::cudev::exp_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1exp__func_3_01uint_01_4.html#ab1ca81dfae2fa4613035d53d71337b2e',1,'cv::cudev::exp_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dde/structcv_1_1cudev_1_1exp__func_3_01ushort_01_4.html#a07d2ad1cb4b3aa588eb4ffc44a18cef8',1,'cv::cudev::exp_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/df/db2/classcv_1_1cuda_1_1FastOpticalFlowBM.html#ac149a65983f02fa91a5a7a53eb232cf2',1,'cv::cuda::FastOpticalFlowBM::operator()()'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a5d5793f2f71bae1cb72acc3e95d069df',1,'cv::detail::FeaturesMatcher::operator()(const ImageFeatures &features1, const ImageFeatures &features2, MatchesInfo &matches_info)'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a2df19558a646700d9543841cafae4bc2',1,'cv::detail::FeaturesMatcher::operator()(const std::vector< ImageFeatures > &features, std::vector< MatchesInfo > &pairwise_matches, const cv::UMat &mask=cv::UMat())'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ad2ed48a66be94fae14bc3a2a08ea8e95',1,'cv::GCompiled::operator()(GRunArgs &&ins, GRunArgsP &&outs)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a8ada1c617461a8b366b997be5c438d4a',1,'cv::GCompiled::operator()(cv::Mat in, cv::Mat &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a68bcf146b1479be128ee4bb39035fc43',1,'cv::GCompiled::operator()(cv::Mat in, cv::Scalar &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a7878a8cf7a6e5f5542777c8e1b5c977a',1,'cv::GCompiled::operator()(cv::Mat in1, cv::Mat in2, cv::Mat &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ac7ea0e242325db157f9dc95cf2c47845',1,'cv::GCompiled::operator()(cv::Mat in1, cv::Mat in2, cv::Scalar &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#aa4751e20cd8fa27947b073366d3c130c',1,'cv::GCompiled::operator()(const std::vector< cv::Mat > &ins, const std::vector< cv::Mat > &outs)'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#a8a2d9c2741c247165e1778a35eeedec7',1,'cv::cudev::GlobPtr::operator()(int y, int x)'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#a630b28b0982df38fa4a8370df54c8876',1,'cv::cudev::GlobPtr::operator()(int y, int x) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a2b3c25e36b0f82ca8f9f74b6ae68c41d',1,'cv::cuda::GpuMat::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a217e27e7051bed168c34ba767915cc63',1,'cv::cuda::GpuMat::operator()(Rect roi) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#aa1ccd7742a80a4f084c78f1d61601073',1,'cv::cudev::GpuMat_::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a5770b11d962d14d542b915f81441ccb4',1,'cv::cudev::GpuMat_::operator()(Rect roi) const'],['https://docs.opencv.org/4.2.0/d9/d1c/structcv_1_1cudev_1_1greater.html#a094203d3b37c3c215eac4c0250577dd3',1,'cv::cudev::greater::operator()()'],['https://docs.opencv.org/4.2.0/dd/d08/structcv_1_1cudev_1_1greater__equal.html#af19f72ea85d3d1fbff57c2cbe0cbb05e',1,'cv::cudev::greater_equal::operator()()'],['https://docs.opencv.org/4.2.0/d3/d59/structcv_1_1Hamming.html#a3d6ec47bfdc0d89f191428ccbfe00823',1,'cv::Hamming::operator()()'],['https://docs.opencv.org/4.2.0/d3/d10/structstd_1_1hash_3_01cv_1_1gapi_1_1GBackend_01_4.html#a5064b9ea589368a0f1814598cfcb67c8',1,'std::hash< cv::gapi::GBackend >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d99/structstd_1_1hash_3_01cv_1_1GShape_01_4.html#aabcf77cfe57beafe3afffb118967829a',1,'std::hash< cv::GShape >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d3e/structcv_1_1cudev_1_1hypot__func.html#a2f42ede8772f0144017fbfc07486947d',1,'cv::cudev::hypot_func::operator()()'],['https://docs.opencv.org/4.2.0/d6/d05/structcv_1_1cudev_1_1hypot__func_3_01double_01_4.html#ac8bf27e184911fc704e88916c649111c',1,'cv::cudev::hypot_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d37/structcv_1_1cudev_1_1hypot__func_3_01float_01_4.html#a66cf4ee063a301dc96ee60077be2294f',1,'cv::cudev::hypot_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/df/dbd/structcv_1_1cudev_1_1hypot__func_3_01schar_01_4.html#aaf99e66892b49d09d373efd1f40fa989',1,'cv::cudev::hypot_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d0b/structcv_1_1cudev_1_1hypot__func_3_01short_01_4.html#a09105d3f2332f484875c304fba5bcc0e',1,'cv::cudev::hypot_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/db0/structcv_1_1cudev_1_1hypot__func_3_01uchar_01_4.html#aa16959b94a6a1da0516f20fefa457cca',1,'cv::cudev::hypot_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dad/structcv_1_1cudev_1_1hypot__func_3_01uint_01_4.html#a6f4a739bd0d21bd64e163cfb091fc3e2',1,'cv::cudev::hypot_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d26/structcv_1_1cudev_1_1hypot__func_3_01ushort_01_4.html#a32ad689516093e2d048d47e1775e71bf',1,'cv::cudev::hypot_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/df/d22/structcv_1_1cudev_1_1identity.html#ae8e53f80a081edd0156421f7e502674a',1,'cv::cudev::identity::operator()()'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#ab439f549a54e7fb4d077d51e26fc1e81',1,'cv::cudev::IntegerAreaInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1L1.html#a6e1989c64affb81cd157f49f9b8b93b0',1,'cv::L1::operator()()'],['https://docs.opencv.org/4.2.0/dc/daa/structcv_1_1L2.html#a1bd9f1b3a846126410d188c72645c25d',1,'cv::L2::operator()()'],['https://docs.opencv.org/4.2.0/d0/de6/structcv_1_1cudev_1_1LaplacianPtr_3_011_00_01SrcPtr_01_4.html#a378fe7b55d2ee57979706e7cbd3a3dde',1,'cv::cudev::LaplacianPtr< 1, SrcPtr >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d89/structcv_1_1cudev_1_1LaplacianPtr_3_013_00_01SrcPtr_01_4.html#af02fec60f0690261a54910e6e1ca5542',1,'cv::cudev::LaplacianPtr< 3, SrcPtr >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d04/structcv_1_1cudev_1_1less.html#aef70d1d8dee6dca98128735c2a60f486',1,'cv::cudev::less::operator()()'],['https://docs.opencv.org/4.2.0/d1/d03/structcv_1_1cudev_1_1less__equal.html#a35cab8e57e6e215821e61ed7d116045e',1,'cv::cudev::less_equal::operator()()'],['https://docs.opencv.org/4.2.0/d7/d8a/structcv_1_1cudev_1_1LinearInterPtr.html#a354dbbfbda853a6497da10ac614732ea',1,'cv::cudev::LinearInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d8/da8/structcv_1_1cudev_1_1log10__func.html#a8ed0d87633e88b1e5ec26ccb62017a84',1,'cv::cudev::log10_func::operator()()'],['https://docs.opencv.org/4.2.0/dc/d32/structcv_1_1cudev_1_1log10__func_3_01double_01_4.html#a55aa0560ae5a0fc01487540ff1658e87',1,'cv::cudev::log10_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d42/structcv_1_1cudev_1_1log10__func_3_01float_01_4.html#ae7011f3b9f7529c765c6d4433e93d9bc',1,'cv::cudev::log10_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d4b/structcv_1_1cudev_1_1log10__func_3_01schar_01_4.html#ab04065a7b741671ea7050e5367a94362',1,'cv::cudev::log10_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d00/structcv_1_1cudev_1_1log10__func_3_01short_01_4.html#a4490ba24cdd88c8c1708830583aef024',1,'cv::cudev::log10_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/dd/dcc/structcv_1_1cudev_1_1log10__func_3_01uchar_01_4.html#a4f9937403d93a32fe7d0e9b18831821c',1,'cv::cudev::log10_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/df/d6e/structcv_1_1cudev_1_1log10__func_3_01uint_01_4.html#af462996a0b52e703042273d4533983b7',1,'cv::cudev::log10_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d0/df1/structcv_1_1cudev_1_1log10__func_3_01ushort_01_4.html#aef130449d3276fedd53036bbaafe6828',1,'cv::cudev::log10_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1cudev_1_1log2__func.html#aba0f8b5ead7e4fb3e6f8c6f2cbcddca9',1,'cv::cudev::log2_func::operator()()'],['https://docs.opencv.org/4.2.0/dc/d17/structcv_1_1cudev_1_1log2__func_3_01double_01_4.html#ae825f360d7a8c1c2976ec16a52afcbe3',1,'cv::cudev::log2_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/db/dba/structcv_1_1cudev_1_1log2__func_3_01float_01_4.html#afdfb43df5d0d168e65bfa795f0654034',1,'cv::cudev::log2_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1log2__func_3_01schar_01_4.html#aeb64ee83eecff169547ebf72ff37f2f4',1,'cv::cudev::log2_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d0b/structcv_1_1cudev_1_1log2__func_3_01short_01_4.html#a7dc4e28152086625533614481d4c436f',1,'cv::cudev::log2_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d41/structcv_1_1cudev_1_1log2__func_3_01uchar_01_4.html#a169dfefed3bcccacbf67bdb20f119f5e',1,'cv::cudev::log2_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/df/d69/structcv_1_1cudev_1_1log2__func_3_01uint_01_4.html#ae44865085e382670f17536552d9f8d1a',1,'cv::cudev::log2_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d0/dda/structcv_1_1cudev_1_1log2__func_3_01ushort_01_4.html#afe1f535584f0fcaa41dd4aac88871bd9',1,'cv::cudev::log2_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d41/structcv_1_1cudev_1_1log__func.html#a943bb3c0839bc97fc724689bb0fe8651',1,'cv::cudev::log_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/dad/structcv_1_1cudev_1_1log__func_3_01double_01_4.html#ad41e4d4a49cba0a2f14ce7b44860f102',1,'cv::cudev::log_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d85/structcv_1_1cudev_1_1log__func_3_01float_01_4.html#ad9d324de3522e32adda4eed82c24669b',1,'cv::cudev::log_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d2/de1/structcv_1_1cudev_1_1log__func_3_01schar_01_4.html#a299f70fa2dc5d67e51165035904d9eb8',1,'cv::cudev::log_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d19/structcv_1_1cudev_1_1log__func_3_01short_01_4.html#a77a4daf23da2dd3f99aa6559106101b4',1,'cv::cudev::log_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d3/db5/structcv_1_1cudev_1_1log__func_3_01uchar_01_4.html#a877322f5cbcc6845276f7096a39a59d2',1,'cv::cudev::log_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d0/dee/structcv_1_1cudev_1_1log__func_3_01uint_01_4.html#a6d1fe6935269490408f023d6dbc82d80',1,'cv::cudev::log_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d0c/structcv_1_1cudev_1_1log__func_3_01ushort_01_4.html#a25d4a879c093d9c65d9ae24021a599c9',1,'cv::cudev::log_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1cudev_1_1logical__and.html#a6a80f03acb116ed9e5f3f533dd8cf1a6',1,'cv::cudev::logical_and::operator()()'],['https://docs.opencv.org/4.2.0/d4/d01/structcv_1_1cudev_1_1logical__not.html#a5d6fd2eb21769c8ab859395f9aaad133',1,'cv::cudev::logical_not::operator()()'],['https://docs.opencv.org/4.2.0/d3/db2/structcv_1_1cudev_1_1logical__or.html#a682a316f3d1c904a8b03f4132a432955',1,'cv::cudev::logical_or::operator()()'],['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html#a45ddaa9b235af7db44bb4cee9fc02a04',1,'cv::cudev::LutPtr::operator()()'],['https://docs.opencv.org/4.2.0/d1/deb/structcv_1_1cudev_1_1magnitude__func.html#a89c8b5fbcd6dfe676ac11e6e4b339287',1,'cv::cudev::magnitude_func::operator()()'],['https://docs.opencv.org/4.2.0/d3/da4/structcv_1_1cudev_1_1magnitude__sqr__func.html#aaaab7e87a8f39b310caf6f0e20a623c3',1,'cv::cudev::magnitude_sqr_func::operator()()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ad543b6bd296ae1247032c750af4718e1',1,'cv::Mat::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a4272fce43d7405603fbb5e5f52580e57',1,'cv::Mat::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aee56475f834069b1fad3877c0747aaeb',1,'cv::Mat::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa9bf4fcbb6e854a6db7b7254a205fac9',1,'cv::Mat::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#aafddf1814d6868d7c67220cf5726f932',1,'cv::gapi::own::Mat::operator()()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'cv::Mat_::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'cv::Mat_::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'cv::Mat_::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'cv::Mat_::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'cv::Mat_::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'cv::Mat_::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'cv::Mat_::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'cv::Mat_::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'cv::Mat_::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'cv::Mat_::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'cv::Mat_::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'cv::Mat_::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'cv::Mat_::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'cv::Mat_::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'cv::Mat_::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'cv::Mat_::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< double >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< double >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< double >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< double >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< double >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< double >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< double >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< double >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< double >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< double >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< double >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< double >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< double >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< double >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< double >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< double >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< float >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< float >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< float >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< float >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< float >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< float >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< float >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< float >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< float >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< float >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< float >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< float >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< float >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< float >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< float >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< float >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< uchar >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< uchar >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< uchar >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< uchar >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< uchar >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< uchar >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< uchar >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< uchar >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< uchar >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< uchar >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< uchar >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< uchar >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< uchar >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< uchar >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< uchar >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< uchar >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< unsigned char >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< unsigned char >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< unsigned char >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< unsigned char >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< unsigned char >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< unsigned char >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< unsigned char >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< unsigned char >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< unsigned char >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< unsigned char >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< unsigned char >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< unsigned char >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< unsigned char >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< unsigned char >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< unsigned char >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< unsigned char >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6bceaa05f2fea4c73bc95f4b9e7d09bf',1,'cv::MatExpr::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae3d4aa0cf6b40c5829c6377a54101068',1,'cv::MatExpr::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#abdc35c3d1d636243a9fa4b7e3a4810fe',1,'cv::MatSize::operator()()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'cv::Matx::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'cv::Matx::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'cv::Matx::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'cv::Matx::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< _Tp, cn, 1 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< _Tp, cn, 1 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< _Tp, cn, 1 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< _Tp, cn, 1 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 1, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 1, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 1, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 1, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 2, 2 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 2, 2 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 2, 2 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 2, 2 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 2, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 2, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 2, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 2, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 3, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 3, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 3, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 3, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 3, 4 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 3, 4 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 3, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 3, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 4, 4 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 4, 4 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 4, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 4, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, cn, 1 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, cn, 1 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, cn, 1 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, cn, 1 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float, 2, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float, 2, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float, 2, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float, 2, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float, 3, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float, 3, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float, 3, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float, 3, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float, cn, 1 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float, cn, 1 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float, cn, 1 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float, cn, 1 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float_type, 4, 4 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float_type, 4, 4 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float_type, 4, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float_type, 4, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d4/d31/structcv_1_1cudev_1_1maximum.html#a23944a3a9a900d9121217a9b2bd7cf1e',1,'cv::cudev::maximum::operator()()'],['https://docs.opencv.org/4.2.0/dc/d65/structcv_1_1cudev_1_1maximum_3_01double_01_4.html#aaa3ea51b43edde4613cd12bfdcb9d760',1,'cv::cudev::maximum< double >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d1e/structcv_1_1cudev_1_1maximum_3_01float_01_4.html#a38c973c79baab206514a0b3108633add',1,'cv::cudev::maximum< float >::operator()()'],['https://docs.opencv.org/4.2.0/df/df2/structcv_1_1cudev_1_1maximum_3_01schar_01_4.html#a5ec2a8da9db4e38703a428def99c26d2',1,'cv::cudev::maximum< schar >::operator()()'],['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1maximum_3_01short_01_4.html#a9d79fb3032785722e26b00a37995a045',1,'cv::cudev::maximum< short >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d84/structcv_1_1cudev_1_1maximum_3_01uchar_01_4.html#a98a3d896491e04c7d9977eed91f2362f',1,'cv::cudev::maximum< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dfa/structcv_1_1cudev_1_1maximum_3_01uint_01_4.html#a6f78b59b8fde2766a8827de3f01d8db8',1,'cv::cudev::maximum< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d0/dac/structcv_1_1cudev_1_1maximum_3_01ushort_01_4.html#a5bda4bdb72d47bcb77ff15390922e450',1,'cv::cudev::maximum< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a8c678dd239c97b2fd12611f1363900f0',1,'cv::stereo::MCTKernel::operator()()'],['https://docs.opencv.org/4.2.0/de/d9b/classcv_1_1stereo_1_1MeanKernelIntegralImage.html#a806da8fa9a91098398f78c36d79e3991',1,'cv::stereo::MeanKernelIntegralImage::operator()()'],['https://docs.opencv.org/4.2.0/d5/dc9/structcv_1_1cudev_1_1minimum.html#acdf2ef08e5d48af75d2122e8671aea68',1,'cv::cudev::minimum::operator()()'],['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1minimum_3_01double_01_4.html#a48a0b885006be6a0fa8e9d11c54d4e5b',1,'cv::cudev::minimum< double >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d9d/structcv_1_1cudev_1_1minimum_3_01float_01_4.html#a8fbc1f931bb9d8d68e623e7bc561382a',1,'cv::cudev::minimum< float >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d75/structcv_1_1cudev_1_1minimum_3_01schar_01_4.html#a8f420b811fad523efc6aa53007d6d966',1,'cv::cudev::minimum< schar >::operator()()'],['https://docs.opencv.org/4.2.0/db/d5b/structcv_1_1cudev_1_1minimum_3_01short_01_4.html#af73ef8474d4331959f890e839e0c6253',1,'cv::cudev::minimum< short >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d48/structcv_1_1cudev_1_1minimum_3_01uchar_01_4.html#a7deb2150864ae4502dc4441bc12d4336',1,'cv::cudev::minimum< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1cudev_1_1minimum_3_01uint_01_4.html#adf25e14f21fe7eb1537a294d819d79d1',1,'cv::cudev::minimum< uint >::operator()()'],['https://docs.opencv.org/4.2.0/de/dfa/structcv_1_1cudev_1_1minimum_3_01ushort_01_4.html#ac33cd62d0c0ebbeed517eab9d577517d',1,'cv::cudev::minimum< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/da/df1/structcv_1_1cudev_1_1minus.html#aa2c21f87c2bc60ae0d5c5d7770b023c8',1,'cv::cudev::minus::operator()()'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#a33ef2dffc9591c30f8fee5f6b5ae7e04',1,'cv::stereo::ModifiedCsCensus::operator()()'],['https://docs.opencv.org/4.2.0/d7/d7f/structcv_1_1cudev_1_1modulus.html#adbb9a4b035592f32258f013f378d50dd',1,'cv::cudev::modulus::operator()()'],['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1cudev_1_1multiplies.html#ae098f5637977e29132fbb3a8607921a9',1,'cv::cudev::multiplies::operator()()'],['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#a2e082e01e62b186decf5a1f58884dd80',1,'cv::stereo::MVKernel::operator()()'],['https://docs.opencv.org/4.2.0/d0/df5/structcv_1_1cudev_1_1NearestInterPtr.html#afa902e3d702382f0a68112d8342b24f3',1,'cv::cudev::NearestInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1negate.html#a9729e5847cd4d6004ac225e156cdbe86',1,'cv::cudev::negate::operator()()'],['https://docs.opencv.org/4.2.0/df/d9f/structcv_1_1cudev_1_1not__equal__to.html#ac80d0c172252fb5bc65ed4671113ea23',1,'cv::cudev::not_equal_to::operator()()'],['https://docs.opencv.org/4.2.0/d2/d74/classcv_1_1ParallelLoopBody.html#a90285bcea9c56345622bfd6817d41b1f',1,'cv::ParallelLoopBody::operator()()'],['https://docs.opencv.org/4.2.0/d3/d78/classcv_1_1ParallelLoopBodyLambdaWrapper.html#a6b7b341ff554b63cda3e71f4481a38d7',1,'cv::ParallelLoopBodyLambdaWrapper::operator()()'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a26e76331a68988144a403649c6b8af5c',1,'cv::PCA::operator()(InputArray data, InputArray mean, int flags, int maxComponents=0)'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#aff68797b34e6edb162b0f5d1819b2e9f',1,'cv::PCA::operator()(InputArray data, InputArray mean, int flags, double retainedVariance)'],['https://docs.opencv.org/4.2.0/df/d20/structcv_1_1cudev_1_1PerspectiveMapPtr.html#aa9a16f8b9d196cbac5122f2bea12fada',1,'cv::cudev::PerspectiveMapPtr::operator()()'],['https://docs.opencv.org/4.2.0/d4/dd0/structcv_1_1cudev_1_1plus.html#a149c533def9926ab9d6e6ca57257068a',1,'cv::cudev::plus::operator()()'],['https://docs.opencv.org/4.2.0/da/dda/structcv_1_1cudev_1_1pow__func.html#a4fe691da815bb8f351f6816e4ad7311a',1,'cv::cudev::pow_func::operator()()'],['https://docs.opencv.org/4.2.0/d2/deb/structcv_1_1cudev_1_1pow__func_3_01double_01_4.html#ac79d0918dd34db9fb7703a573ae3e83c',1,'cv::cudev::pow_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d3/dea/structcv_1_1cudev_1_1project1st.html#ab10af9ecf413990340288b5d49d8314e',1,'cv::cudev::project1st::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd5/structcv_1_1cudev_1_1project2nd.html#a33823b1e54a8d5b4085163083b7a460d',1,'cv::cudev::project2nd::operator()()'],['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html#a83f91a025a0f41d3a0b528478a3cb532',1,'cv::cudev::RemapPtr1::operator()()'],['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#ab539f18b7ebc19adf055670324c2bc09',1,'cv::cudev::RemapPtr2::operator()()'],['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#aa890dd8d7b5108f77108b0f3dbf2d87f',1,'cv::cudev::ResizePtr::operator()()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a48c33f26d8662a1b3becfda60292ac5c',1,'cv::rgbd::RgbdNormals::operator()()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a1a638d0a9367b86bc56b98b9e550b9dc',1,'cv::rgbd::RgbdPlane::operator()(InputArray points3d, InputArray normals, OutputArray mask, OutputArray plane_coefficients)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a8c519cbffd2b296330b1ef5081530968',1,'cv::rgbd::RgbdPlane::operator()(InputArray points3d, OutputArray mask, OutputArray plane_coefficients)'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a16ca31c8e2ec0990df323b442ab09e4f',1,'cv::RNG::operator()()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#ac0112dc300696b1fc7998d37f15dd733',1,'cv::RNG::operator()(unsigned N)'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a5102b5f43fc7c2997f2d2bc6b693e0b4',1,'cv::RNG_MT19937::operator()(unsigned N)'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#aa52601c233cda79131052299a88ad9c2',1,'cv::RNG_MT19937::operator()()'],['https://docs.opencv.org/4.2.0/d3/d11/structcv_1_1cudev_1_1saturate__cast__fp16__func_3_01float_00_01short_01_4.html#a535ca2a5e7cf42d0da2d17fed04daf16',1,'cv::cudev::saturate_cast_fp16_func< float, short >::operator()()'],['https://docs.opencv.org/4.2.0/dc/dc5/structcv_1_1cudev_1_1saturate__cast__fp16__func_3_01short_00_01float_01_4.html#aadd03bfafa293e9fd11986416a8df232',1,'cv::cudev::saturate_cast_fp16_func< short, float >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d99/structcv_1_1cudev_1_1saturate__cast__func.html#addfef20cf8679f6924202369963bd203',1,'cv::cudev::saturate_cast_func::operator()()'],['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1ScharrXPtr.html#ad7c3ca0e1936de91a4da451b12e05461',1,'cv::cudev::ScharrXPtr::operator()()'],['https://docs.opencv.org/4.2.0/d0/d70/structcv_1_1cudev_1_1ScharrYPtr.html#a0d7970b76e5d9f21a0681ca5d794e703',1,'cv::cudev::ScharrYPtr::operator()()'],['https://docs.opencv.org/4.2.0/d1/d65/classcv_1_1SimilarRects.html#a7e70f1c43c4bf8c75851211fb50b265a',1,'cv::SimilarRects::operator()()'],['https://docs.opencv.org/4.2.0/d1/d05/structcv_1_1cudev_1_1sin__func.html#a81bbace4665b94419c862d3dcccdc280',1,'cv::cudev::sin_func::operator()()'],['https://docs.opencv.org/4.2.0/d8/d1c/structcv_1_1cudev_1_1sin__func_3_01double_01_4.html#a8b60b51b51637af0504911dc4d98e2b9',1,'cv::cudev::sin_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d2b/structcv_1_1cudev_1_1sin__func_3_01float_01_4.html#af6ea0d2d4b951bffc9a716a2265c29c9',1,'cv::cudev::sin_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d1b/structcv_1_1cudev_1_1sin__func_3_01schar_01_4.html#a78e9a2b21c9467947f65a9d27036c39f',1,'cv::cudev::sin_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d6f/structcv_1_1cudev_1_1sin__func_3_01short_01_4.html#a8c9bfa6683708b41101edd0290af9fcd',1,'cv::cudev::sin_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dfd/structcv_1_1cudev_1_1sin__func_3_01uchar_01_4.html#a73cc54b71202279bf8805e0c7f0ab847',1,'cv::cudev::sin_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/dbd/structcv_1_1cudev_1_1sin__func_3_01uint_01_4.html#a4511fade1bcfc1f7545c8c8c8c4f3b97',1,'cv::cudev::sin_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d22/structcv_1_1cudev_1_1sin__func_3_01ushort_01_4.html#a0a9f7a66d2a283b05e08ac48947d77f7',1,'cv::cudev::sin_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#a35f754723c723f5ac9ae9c6ae5ddf27d',1,'cv::cudev::SingleMaskChannels::operator()()'],['https://docs.opencv.org/4.2.0/d8/da0/structcv_1_1cudev_1_1sinh__func.html#aa12abb185d04fd4e0df2c97af973366b',1,'cv::cudev::sinh_func::operator()()'],['https://docs.opencv.org/4.2.0/db/dde/structcv_1_1cudev_1_1sinh__func_3_01double_01_4.html#ae0418acd67e1ea0a541a315623bf14fa',1,'cv::cudev::sinh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d3/df1/structcv_1_1cudev_1_1sinh__func_3_01float_01_4.html#a064843f9badf0ed3155b4231bf2ca95c',1,'cv::cudev::sinh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/de/df6/structcv_1_1cudev_1_1sinh__func_3_01schar_01_4.html#a6f95259b1094b0b7bbc5bdb47cafbfad',1,'cv::cudev::sinh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/da/d3e/structcv_1_1cudev_1_1sinh__func_3_01short_01_4.html#a01703492193b054aece7b2d8f2b11357',1,'cv::cudev::sinh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d4/dd2/structcv_1_1cudev_1_1sinh__func_3_01uchar_01_4.html#ae09891519bc4df762a12bedbcc1e41c3',1,'cv::cudev::sinh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/de/d13/structcv_1_1cudev_1_1sinh__func_3_01uint_01_4.html#a0f28cf3217ef7ae5e6be21ee888a0d2d',1,'cv::cudev::sinh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d38/structcv_1_1cudev_1_1sinh__func_3_01ushort_01_4.html#a6667d95cc7c1a83c4c9518a7848ab83d',1,'cv::cudev::sinh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html#a7a6c92810b7489377eb91727182b0e60',1,'cv::SL2::operator()()'],['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1SobelXPtr.html#a50ddaa92c615685b26263653013fffc4',1,'cv::cudev::SobelXPtr::operator()()'],['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1SobelYPtr.html#a96976834e33e5c4735361a8c62b7e68f',1,'cv::cudev::SobelYPtr::operator()()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ad7c0f0164b060df2179b3e9f1d1566a8',1,'cv::SparseMat_::operator()(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a89b99bb281a9747b54e94be670f6a010',1,'cv::SparseMat_::operator()(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ab4ffea87933a1bffcadd0db260c36846',1,'cv::SparseMat_::operator()(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ae68f3e59954cc03297b2d0e6e8ba9014',1,'cv::SparseMat_::operator()(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d9/d1d/structcv_1_1cudev_1_1sqr__func.html#a653443fdeefc72965e7ff269f28bb9dc',1,'cv::cudev::sqr_func::operator()()'],['https://docs.opencv.org/4.2.0/d9/d47/structcv_1_1cudev_1_1sqrt__func.html#a3c13827c0c81360668c03101aec9f447',1,'cv::cudev::sqrt_func::operator()()'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1cudev_1_1sqrt__func_3_01double_01_4.html#a0ed5e0351bd2e8fc4012c231307269b4',1,'cv::cudev::sqrt_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dd2/structcv_1_1cudev_1_1sqrt__func_3_01float_01_4.html#a03e90b3bb7445759653b84ccd259a22d',1,'cv::cudev::sqrt_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/da/d64/structcv_1_1cudev_1_1sqrt__func_3_01schar_01_4.html#aa4afd2cf29659cfb2e992b78aa383038',1,'cv::cudev::sqrt_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d6a/structcv_1_1cudev_1_1sqrt__func_3_01short_01_4.html#a0f6eeddb105a2097a452b52c1dfc384b',1,'cv::cudev::sqrt_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d33/structcv_1_1cudev_1_1sqrt__func_3_01uchar_01_4.html#a3196e3954b0e70277deba6b6ded42ec7',1,'cv::cudev::sqrt_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d7b/structcv_1_1cudev_1_1sqrt__func_3_01uint_01_4.html#a42e59fdead1f2063b1b06e89b3d915e9',1,'cv::cudev::sqrt_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/df/df4/structcv_1_1cudev_1_1sqrt__func_3_01ushort_01_4.html#adac64ea929bfe2d165affcbf44a767df',1,'cv::cudev::sqrt_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1stereo_1_1StarKernelCensus.html#a3d6e4998cc5b42e0fce4cc490251de9e',1,'cv::stereo::StarKernelCensus::operator()()'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a67ee54d1221b03d9866393effaeeb8dd',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, GpuMat &keypoints)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#aa0ed78380fe2142a729e424aa195263c',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, GpuMat &keypoints, GpuMat &descriptors, bool useProvidedKeypoints=false)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a9bb91e3bffd09e0e65c91c45da669304',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, std::vector< KeyPoint > &keypoints)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#aec817660a3ecbb64f0afa54354a8af5c',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, std::vector< KeyPoint > &keypoints, GpuMat &descriptors, bool useProvidedKeypoints=false)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#ad254c526ba8d61e66a40ebabf5a6c847',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, std::vector< KeyPoint > &keypoints, std::vector< float > &descriptors, bool useProvidedKeypoints=false)'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#ad9ade269f8234b171413e4ff639a3128',1,'cv::SVD::operator()()'],['https://docs.opencv.org/4.2.0/dd/d24/classcv_1_1stereo_1_1SymetricCensus.html#a8b4e095d57a6cc44fd4997af55f2d34b',1,'cv::stereo::SymetricCensus::operator()()'],['https://docs.opencv.org/4.2.0/d7/d3e/structcv_1_1cudev_1_1tan__func.html#a2482523afd1e226cf46eca69ab6ded31',1,'cv::cudev::tan_func::operator()()'],['https://docs.opencv.org/4.2.0/db/dc4/structcv_1_1cudev_1_1tan__func_3_01double_01_4.html#abe568bfe0f6458d5f94824e3c8133869',1,'cv::cudev::tan_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d4e/structcv_1_1cudev_1_1tan__func_3_01float_01_4.html#ac7092cea3ad156fa30ff5a7aeefb1dfa',1,'cv::cudev::tan_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d9d/structcv_1_1cudev_1_1tan__func_3_01schar_01_4.html#a5d739a35f50c97b273f822c325204d24',1,'cv::cudev::tan_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dbd/structcv_1_1cudev_1_1tan__func_3_01short_01_4.html#a57af0b55d41554ecea3a1bf5ef4c7653',1,'cv::cudev::tan_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d0d/structcv_1_1cudev_1_1tan__func_3_01uchar_01_4.html#a03d6d6b2c000bd957bfa4df61f8a744f',1,'cv::cudev::tan_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d9e/structcv_1_1cudev_1_1tan__func_3_01uint_01_4.html#a6bf5488503341bbacb61b959103c7702',1,'cv::cudev::tan_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d63/structcv_1_1cudev_1_1tan__func_3_01ushort_01_4.html#a4ad3366dca634dbe0edb6b8e8e4a3739',1,'cv::cudev::tan_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1tanh__func.html#acdf93453f1d2131aecd26c37d3cfc79d',1,'cv::cudev::tanh_func::operator()()'],['https://docs.opencv.org/4.2.0/d4/d9f/structcv_1_1cudev_1_1tanh__func_3_01double_01_4.html#a58e54574cb02f13e2129204c349a8f9c',1,'cv::cudev::tanh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/dc/da0/structcv_1_1cudev_1_1tanh__func_3_01float_01_4.html#a7e21f8cf9b8d4cc3fa043fc80c3ea11c',1,'cv::cudev::tanh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d5/dfc/structcv_1_1cudev_1_1tanh__func_3_01schar_01_4.html#ab297810c17a3e1b9c39b32d71c2b6f9f',1,'cv::cudev::tanh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d8/db4/structcv_1_1cudev_1_1tanh__func_3_01short_01_4.html#a66d82124b6cfae4ab90e027781b3e366',1,'cv::cudev::tanh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d5a/structcv_1_1cudev_1_1tanh__func_3_01uchar_01_4.html#a217df735a2b55e8c29cc1877b65ffc96',1,'cv::cudev::tanh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/df/dc6/structcv_1_1cudev_1_1tanh__func_3_01uint_01_4.html#a8d6d358bc9a39244a0d829745d9b782f',1,'cv::cudev::tanh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d68/structcv_1_1cudev_1_1tanh__func_3_01ushort_01_4.html#a451a091258448763568c3148ecc90b1b',1,'cv::cudev::tanh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d09/structcv_1_1cudev_1_1TexturePtr.html#a37f533d175f7d132cfa0dbda2e9e4426',1,'cv::cudev::TexturePtr::operator()()'],['https://docs.opencv.org/4.2.0/df/df5/structcv_1_1cudev_1_1ThreshBinaryFunc.html#a52270b71a069ba892ffb1d99691466c3',1,'cv::cudev::ThreshBinaryFunc::operator()()'],['https://docs.opencv.org/4.2.0/da/d5e/structcv_1_1cudev_1_1ThreshBinaryInvFunc.html#a08286d7152097d42df33551d2459bc40',1,'cv::cudev::ThreshBinaryInvFunc::operator()()'],['https://docs.opencv.org/4.2.0/df/dd9/structcv_1_1cudev_1_1ThreshToZeroFunc.html#a5b5819f10125f84dc7ac7718b0515207',1,'cv::cudev::ThreshToZeroFunc::operator()()'],['https://docs.opencv.org/4.2.0/d8/d7e/structcv_1_1cudev_1_1ThreshToZeroInvFunc.html#a7b9e1075aefc2fbece94477f96efeab8',1,'cv::cudev::ThreshToZeroInvFunc::operator()()'],['https://docs.opencv.org/4.2.0/d0/d44/structcv_1_1cudev_1_1ThreshTruncFunc.html#a58e38cea97c6bc26b2a221b94af6b44a',1,'cv::cudev::ThreshTruncFunc::operator()()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a84b1f570775c927202a55ab1cccd9542',1,'cv::UMat::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a7679d5bea4421e360b90225d348e3fa3',1,'cv::UMat::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a0e245fe34228df0f31d3e3fdb6fa89d3',1,'cv::UMat::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#af4e69198d95654e9fe2bd03dd1feee38',1,'cv::UMat::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/d2/d83/structcv_1_1cudev_1_1UnaryNegate.html#a62a01b748a748f41e8151aa12feedd5b',1,'cv::cudev::UnaryNegate::operator()()'],['https://docs.opencv.org/4.2.0/dd/d01/structcv_1_1cudev_1_1UnaryTransformPtr.html#aeaea7fc6e3a4cebe1a5b4dbfd8aa916c',1,'cv::cudev::UnaryTransformPtr::operator()()'],['https://docs.opencv.org/4.2.0/d4/d57/structcv_1_1cudev_1_1UnaryTupleAdapter.html#ac5ef68bb68529b28058ef3728c5e8e28',1,'cv::cudev::UnaryTupleAdapter::operator()()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'cv::Vec::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'cv::Vec::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< _Tp, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< _Tp, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, 2 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, 2 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, nFeatures >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, nFeatures >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< float, 2 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< float, 2 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< float, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< float, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/da/d2c/structcv_1_1cudev_1_1WithOutMask.html#a0c1b6a4167eb490a4ccb48fd8c6fdacf',1,'cv::cudev::WithOutMask::operator()()'],['https://docs.opencv.org/4.2.0/dd/de4/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_01_4_01_4.html#a52971b170c17e2be804c1d31cb760264',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1 > >::operator()()'],['https://docs.opencv.org/4.2.0/d4/dff/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_01_4_01_4.html#a68f55e98fda4a897c29d2d4f49826f27',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2 > >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d2b/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_00_01Ptr3_01_4_01_4.html#af47fca22fa2dd342cd135d15a5015495',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2, Ptr3 > >::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html#a01fb6415bad2c6df91eb607f863fd9e5',1,'__gnu_cxx::subtractive_rng::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09463.html#a3cf37f56d2b37200d0708f75f872ada7',1,'__gnu_parallel::__accumulate_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09411.html#afba73305cf46d20618b0deb3cbd4a1ba',1,'__gnu_parallel::__adjacent_find_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09459.html#a56b55a96d25ead3f5a39c062913f7804',1,'__gnu_parallel::__count_if_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09455.html#a0e1e5ee862269d12a04fd59864f07e66',1,'__gnu_parallel::__count_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09435.html#a1e3e5bf39d889705dbb9424ac1a4fc01',1,'__gnu_parallel::__fill_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09419.html#ab86537005f7f266bbaebc18f9d44b077',1,'__gnu_parallel::__find_first_of_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09407.html#ab5c063395b4e4f3e1be257ac5327f8b2',1,'__gnu_parallel::__find_if_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09427.html#a96ab04030fc97ceace13df652312cca7',1,'__gnu_parallel::__for_each_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09431.html#aace006f0e22d008dbfbd4170ec504ff4',1,'__gnu_parallel::__generate_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09471.html#a5a619614699498f9a13f1c64d27005e6',1,'__gnu_parallel::__identity_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09467.html#aa518cf31e5b678e0ad8ed27ec50b995f',1,'__gnu_parallel::__inner_product_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09415.html#acce7eaf03f5dcb028e255f8b40ad9dfd',1,'__gnu_parallel::__mismatch_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09451.html#aac84e11aceb0e9a3a784639d4df228c3',1,'__gnu_parallel::__replace_if_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09447.html#af3f1faaa44808a57f241b03a0f9be9a5',1,'__gnu_parallel::__replace_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09439.html#a8292d668f885bee0747c9d154fb9a77e',1,'__gnu_parallel::__transform1_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09443.html#a4e0226a0b61723e0e8e716fb3a8be78f',1,'__gnu_parallel::__transform2_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09479.html#ac510e7f38f4ddc7d13db646cb65d2e25',1,'__gnu_parallel::_Nothing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09671.html#ac0da7b514eddc08518d496c93015bb39',1,'__gnu_parallel::_RandomNumber::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09671.html#a58e1450c9d06b629dde759438bc7d83c',1,'__gnu_parallel::_RandomNumber::operator()(uint64_t local_supremum)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11151.html#a01ee7eade182938e160f79cb9c68d73c',1,'__gnu_pbds::direct_mask_range_hashing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11155.html#a0b75e4a9b61ac153724d2c120d2a56dd',1,'__gnu_pbds::direct_mod_range_hashing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11143.html#a8974edcb80c2e1a8aee992a01b517b34',1,'__gnu_pbds::linear_probe_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#aba9450255401d4b96c50bf7c56d4c49a',1,'__gnu_pbds::lu_counter_policy::operator()() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#afa66044dd6264f0c6d6f1cfd05c2fe34',1,'__gnu_pbds::lu_counter_policy::operator()(metadata_reference r_data) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html#afa1064441fc28b323b7b28176686ef65',1,'__gnu_pbds::lu_move_to_front_policy::operator()() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html#a009f2dea97b29bdffa640258f86b6135',1,'__gnu_pbds::lu_move_to_front_policy::operator()(metadata_reference r_metadata) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11147.html#ae22be7552bf62d81aa93eb0b151e6016',1,'__gnu_pbds::quadratic_probe_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11783.html#aa6ced743b2988788dea80b762e85986d',1,'__gnu_pbds::sample_probe_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11787.html#aa99807ceec7e628556967db52a07bc0b',1,'__gnu_pbds::sample_range_hashing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11791.html#a0dd67bb1412f11f8898f67bb3cd1e8ec',1,'__gnu_pbds::sample_ranged_hash_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12083.html#ae4db417d4455178d78933ae2fae0c0c1',1,'__gnu_pbds::sample_trie_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#ac935e838124407bc51c0bf7c01933341',1,'__gnu_pbds::sample_update_policy::operator()() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#a6eefac672a1bb0513d6d3b145d35fd56',1,'__gnu_pbds::sample_update_policy::operator()(metadata_reference) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#a9f14ab1bc7aee93a77e4c73c37d1b9f5',1,'__gnu_pbds::tree_order_statistics_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#ac03a1d37b467c2f12926fcb78fb2803a',1,'__gnu_pbds::trie_order_statistics_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#a8366820208119a5e4179d91d09d8ea9b',1,'__gnu_pbds::trie_prefix_search_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a72dba48d3f9781e948c535e37e7eabeb',1,'gamma_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a286dd68452eebd137ec7be7852a58fca',1,'gamma_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a72dba48d3f9781e948c535e37e7eabeb',1,'gamma_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a286dd68452eebd137ec7be7852a58fca',1,'gamma_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae67f6ec56c5564a3521d734d90f35501',1,'normal_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a159f2f44c19a01c99cb937297d03604c',1,'normal_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae67f6ec56c5564a3521d734d90f35501',1,'normal_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a159f2f44c19a01c99cb937297d03604c',1,'normal_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#aec456e48e7dd746d11b2836368b7ed6d',1,'std::bernoulli_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a81e88f1000ed08018856b1b908acae12',1,'std::binomial_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#aff0946f83a897c9f8b42f88d9e6d24c6',1,'std::binomial_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#ae2c1bb8200f59e2e62b591676fffbf41',1,'std::cauchy_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a2ddd460528095405f9ee56cf681f306a',1,'std::chi_squared_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07995.html#a8ba28722822c984007c41986305ee762',1,'std::default_delete::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#ab96a2de7f6360a7fc295a0d03f0dfd2e',1,'std::discard_block_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a8213bca3ac8f3617fd3bec4f8ecd55f8',1,'std::discrete_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a11a94d907e89a229cfd4083cb8e6a14c',1,'std::exponential_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#a88eda5b7e1af374a061fdc284e8c2baa',1,'std::extreme_value_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#ab172a885f02391e497338955fbd5a5b7',1,'std::fisher_f_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#ab0bfbd15574ba442c644604dc18c4750',1,'std::function< _Res(_ArgTypes...)>::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a72dba48d3f9781e948c535e37e7eabeb',1,'std::gamma_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a286dd68452eebd137ec7be7852a58fca',1,'std::gamma_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a4a41c317cae02db9d8cc20dbbcd4d77d',1,'std::geometric_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a61bc80ca1745e63a5f22307498737844',1,'std::independent_bits_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#ae42fad7d735fb5d8d96076f70f2f65d4',1,'std::linear_congruential_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#ad9d4f2f1dd2404eeb399f7609e50f1fb',1,'std::locale::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#ae6fb96729b574441550992a32599df9a',1,'std::lognormal_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#a1c8275129594f6b1ac0830e2550698dd',1,'std::negative_binomial_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae67f6ec56c5564a3521d734d90f35501',1,'std::normal_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a159f2f44c19a01c99cb937297d03604c',1,'std::normal_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a9cd86c19e7864fe4f6e7fec1965210e9',1,'std::piecewise_constant_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a3853eb2d024be1171d980339eefb0470',1,'std::piecewise_linear_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a4ca984da5920a260845933c37d20cc2e',1,'std::poisson_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a09b00c6571fa3099f12918955723f41d',1,'std::poisson_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#af3cc39eaa42c2d1177cd98fa8e2e91e3',1,'std::shuffle_order_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a79b8f920240c03c968f96fc34b15c409',1,'std::student_t_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a7b6aa59d4719950a6014d38e1559295c',1,'std::subtract_with_carry_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a40babba47578a39b3bdc5f9b56a64268',1,'std::uniform_int_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#ae424a70312170d3b285bf6039b58cb58',1,'std::uniform_real_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a7f3883c7078a32e87c72157e91776416',1,'std::weibull_distribution::operator()()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AMDOrdering.html#afce433557abcba9e49fa81581a58fa51',1,'Eigen::AMDOrdering::operator()(const MatrixType &mat, PermutationType &perm)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AMDOrdering.html#a7f3fd7224b084f0f5655c97ea8eb6466',1,'Eigen::AMDOrdering::operator()(const SparseSelfAdjointView< SrcType, SrcUpLo > &mat, PermutationType &perm)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1COLAMDOrdering.html#a708cb20191dcd79856d922f262405946',1,'Eigen::COLAMDOrdering::operator()()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#af9fadc22d12e48c82745dad534a1671a',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::operator()(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#ab3dbba4a15d0fe90185d2900e5ef0fd1',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::operator()(Index row, Index col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#a0171eee1d9e582d1ac7ec0f18f5f615a',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::operator()(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#ae6ba07bad9e3026afe54806fdefe32bb',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::operator()(Index row, Index col)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1NaturalOrdering.html#aa39e772105ed66da9e909f2a9385be37',1,'Eigen::NaturalOrdering::operator()()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a09fce82b9bdedb5deb2b223a3d716d3f',1,'Eigen::Transform::operator()(Index row, Index col)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a9672c84cb1477eee118be144e7e5d581',1,'Eigen::Transform::operator()(Index row, Index col) const'],['https://nlohmann.github.io/json/doxygen/structstd_1_1hash_3_01nlohmann_1_1json_01_4_aec1567d1fa47dbe5b77954dce3a55b64.html#aec1567d1fa47dbe5b77954dce3a55b64',1,'std::hash< nlohmann::json >::operator()()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga68c6b644dd17b10637cf74117c44e35e',1,'operator()()(Global Namespace)']]], - ['operator_2a_106',['operator*',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a73e4a0844474b25bf254b08c7e4978d6',1,'cv::FileNodeIterator::operator*()'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a11df3b7dbaf0e16ddb430eab3b62e78f',1,'cv::LineIterator::operator*()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ad54179860880cbc148f2708c5b1fa2f6',1,'cv::MatConstIterator::operator*()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a44e02be61a20baa1ab83de13c7c956b4',1,'cv::MatConstIterator_::operator*()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac66fa81bbfc418c535a7f9f49a900554',1,'cv::MatExpr::operator*(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7f68410debc724a5be5235977b902be5',1,'cv::MatExpr::operator*(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7994c3ff3973cc56aac839dc8683ba51',1,'cv::MatExpr::operator*(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a951bede696efc7ad39b2326c257cb9b5',1,'cv::MatExpr::operator*(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae3d5b4a180f62f30b5874243af312ebb',1,'cv::MatExpr::operator*(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a54d49dc23f7a659f61ec5401b9c48d05',1,'cv::MatExpr::operator*(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaac1439d54057753cddc9330f8f56ea6',1,'cv::MatExpr::operator*(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2eb63d9f7b2d398c8714239114ff2b4e',1,'cv::MatExpr::operator*(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a31e53f019aa164af7e7276440f57f497',1,'cv::MatExpr::operator*(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69bdf2007fa634306dea2e7065f839f9',1,'cv::MatExpr::operator*(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac66fa81bbfc418c535a7f9f49a900554',1,'cv::MatExpr::operator*(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7f68410debc724a5be5235977b902be5',1,'cv::MatExpr::operator*(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7994c3ff3973cc56aac839dc8683ba51',1,'cv::MatExpr::operator*(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a951bede696efc7ad39b2326c257cb9b5',1,'cv::MatExpr::operator*(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae3d5b4a180f62f30b5874243af312ebb',1,'cv::MatExpr::operator*(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a54d49dc23f7a659f61ec5401b9c48d05',1,'cv::MatExpr::operator*(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaac1439d54057753cddc9330f8f56ea6',1,'cv::MatExpr::operator*(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2eb63d9f7b2d398c8714239114ff2b4e',1,'cv::MatExpr::operator*(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a31e53f019aa164af7e7276440f57f497',1,'cv::MatExpr::operator*(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69bdf2007fa634306dea2e7065f839f9',1,'cv::MatExpr::operator*(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a30669620dc39593b9c21b373fd83cac5',1,'cv::MatIterator_::operator*()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'cv::Matx::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'cv::Matx::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'cv::Matx::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'cv::Matx::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'cv::Matx::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'cv::Matx::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'cv::Matx::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'cv::Matx::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< _Tp, cn, 1 >::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< _Tp, cn, 1 >::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< _Tp, cn, 1 >::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< _Tp, cn, 1 >::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< _Tp, cn, 1 >::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< _Tp, cn, 1 >::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 1, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 1, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 1, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 1, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 1, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 1, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 2 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 2 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 2 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 2 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 2 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 2 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 4, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 4, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 4, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 4, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 4, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 4, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, cn, 1 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, cn, 1 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, cn, 1 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, cn, 1 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, cn, 1 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, cn, 1 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 2, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 2, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 2, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 2, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 2, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 2, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 3, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 3, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 3, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 3, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 3, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 3, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, cn, 1 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, cn, 1 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, cn, 1 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, cn, 1 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, cn, 1 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, cn, 1 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float_type, 4, 4 >::operator*(int alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float_type, 4, 4 >::operator*(float alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float_type, 4, 4 >::operator*(double alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, l > &a, const Matx< float_type, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, const Vec< float_type, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float_type, 4, 4 >::operator*(int alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float_type, 4, 4 >::operator*(float alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float_type, 4, 4 >::operator*(double alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, l > &a, const Matx< float_type, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, const Vec< float_type, n > &b)'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a603a8a1c3cc866977c8fbd8b55314c86',1,'cv::MatxCommaInitializer::operator*()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a603a8a1c3cc866977c8fbd8b55314c86',1,'MatxCommaInitializer< _Tp, m, 1 >::operator*()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a98a3906afc1a4005f761124f3fd22e8e',1,'cv::util::optional::operator*()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a37e1e46df264e1fddf325db1e6903c5b',1,'cv::util::optional::operator*() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac2116f5bce2914d578953c6ac8c0da16',1,'cv::softdouble::operator*()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab2ccc99b90013df8b9cf49f6c63842ff',1,'cv::softfloat::operator*()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a1db341e36da96bff57ce3c8d16aa85a2',1,'cv::SparseMatConstIterator_::operator*()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a26262be0fb6504badd2d515e7dbbd648',1,'cv::SparseMatIterator_::operator*()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'cv::Vec::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'cv::Vec::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'cv::Vec::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'cv::Vec::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'cv::Vec::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'cv::Vec::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'cv::Vec::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'cv::Vec::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< _Tp, 4 >::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< _Tp, 4 >::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< _Tp, 4 >::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< _Tp, 4 >::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< _Tp, 4 >::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< _Tp, 4 >::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 2 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 2 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 2 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 2 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 2 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 2 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 2 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 2 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 3 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 3 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 3 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 3 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 3 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 3 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 3 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 3 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 4 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 4 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 4 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 4 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 4 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 4 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 4 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 4 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 2 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 2 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 2 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 2 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 2 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 2 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 2 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 2 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 3 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 3 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 3 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 3 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 3 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 3 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 3 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 3 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d1/d3e/classcv_1_1VecCommaInitializer.html#a43e67fe37475c2c6e7081285cb7a8f56',1,'cv::VecCommaInitializer::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a09753efe38fc494639cbbe005409fe51',1,'__gnu_debug::_Safe_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a8e237d9370458e65ea6141b677e8e8f8',1,'__gnu_debug::_Safe_local_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#a89e62967a92648f52f3da16144bf9b75',1,'__gnu_parallel::_GuardedIterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#aeebd8eab002abaceeeeedbb0850ae617',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11631.html#aab710c87290d148b6dd2eb260ff27a1d',1,'__gnu_pbds::detail::bin_search_tree_node_it_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a50d89bdcb26164ff380a312673cf0f06',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a50d89bdcb26164ff380a312673cf0f06',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a60ad369139de2b800a5a729f10b992bb',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a60ad369139de2b800a5a729f10b992bb',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11867.html#a89338f1c18b5234bf80ef61c8f839359',1,'__gnu_pbds::detail::ov_tree_node_it_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a951a43bd97e277ad638e8cf8229d0af3',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11951.html#a575ff0f4d10725779405d8e83dc27463',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a09753efe38fc494639cbbe005409fe51',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a09753efe38fc494639cbbe005409fe51',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#aa36fe65e861c9fe0e67b77f28d0fea0b',1,'const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a44f292f812c56ddf38a1cded7175fa22',1,'iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#aa36fe65e861c9fe0e67b77f28d0fea0b',1,'point_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a07f5dff121401de22bbc2647de595243',1,'point_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a2e044fd0c71fba38157d3aa588be4518',1,'std::auto_ptr::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#a07c1b7a9f42341013f7a44752596d16e',1,'std::back_insert_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#a1686a970fd21798542dd32e3c2208b95',1,'std::front_insert_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a1a406c868feb4c886b002870abeb8546',1,'std::insert_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#aa68118742e48a3296a39611184764153',1,'std::istreambuf_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#a179357ce2cd1d4a53d9c0e5efb65e4df',1,'std::ostreambuf_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a89ee258fe95b81e17fb0eaf4cb0fd565',1,'std::regex_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a0ae03837c2bb4c283a500b70e00743bd',1,'std::regex_token_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a7af5d174f9cb1016e5028e6a8716753b',1,'std::reverse_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'std::unique_ptr::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Codecvt >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Res_type >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Result< _Res > >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Result_base >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< bool[]>::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#ad0a428546d0ff7ed06cca4c4a1e4522a',1,'Eigen::AngleAxis::operator*(const AngleAxis &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a36fa315e0326beacbf249b56fcd0596e',1,'Eigen::AngleAxis::operator*(const QuaternionType &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ac57e5a22f1646e04a4f8b4cba3825928',1,'Eigen::HouseholderSequence::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html#ada8389f291839964d7b481464f0e4e94',1,'Eigen::JacobiRotation::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a36fb95c37f0a454e0e2e5cb120b2df7f',1,'Eigen::MatrixBase::operator*(const DiagonalBase< DiagonalDerived > &diagonal) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae2d220efbf7047f0894787888288cfcc',1,'Eigen::MatrixBase::operator*(const MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a36fb95c37f0a454e0e2e5cb120b2df7f',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator*(const DiagonalBase< DiagonalDerived > &diagonal) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae2d220efbf7047f0894787888288cfcc',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator*(const MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a36fb95c37f0a454e0e2e5cb120b2df7f',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator*(const DiagonalBase< DiagonalDerived > &diagonal) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae2d220efbf7047f0894787888288cfcc',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator*(const MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'Eigen::PermutationBase::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'Eigen::PermutationBase::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'Eigen::QuaternionBase::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#adbfbf2d1ccdf50999bad7688348f4ac2',1,'Eigen::Rotation2D::operator*(const Rotation2D &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ad0ad69c781232313b7d01f981148f230',1,'Eigen::Rotation2D::operator*(const Vector2 &vec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'Eigen::RotationBase::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'Eigen::RotationBase::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'Eigen::RotationBase::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'Eigen::RotationBase::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Derived, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Derived, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Derived, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Derived, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af18c39fdc7783c63766ba22ce0e784c3',1,'Eigen::SelfAdjointView::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af18c39fdc7783c63766ba22ce0e784c3',1,'SelfAdjointView< const Derived, UpLo >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'Eigen::SparseMatrixBase::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< Transpose< MatrixType > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a887e3b5fa468af8413276141ddc8bb93',1,'Eigen::SparseSelfAdjointView::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a9d1e5ef26775e3b43be08fd4ae191aa8',1,'Eigen::SparseSelfAdjointView::operator*(const SparseMatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a887e3b5fa468af8413276141ddc8bb93',1,'SparseSelfAdjointView< const Derived, UpLo >::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a9d1e5ef26775e3b43be08fd4ae191aa8',1,'SparseSelfAdjointView< const Derived, UpLo >::operator*(const SparseMatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ab3d93a2aba9d06e7d134798f92617da7',1,'Eigen::Transform::operator*(const DiagonalBase< DiagonalDerived > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a257ab8b9141982bd6f56771ba822526f',1,'Eigen::Transform::operator*(const EigenBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a7e75d983600d35b603f740a3a28bbc6c',1,'Eigen::Transform::operator*(const Transform &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ad4fc26aef2abfb9fdadb7d64aaf58c31',1,'Eigen::Transform::operator*(const Transform< Scalar, Dim, OtherMode, OtherOptions > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a2289ae59c8f871d9d9c73ba7eeb035f8',1,'Eigen::Translation::operator*(const EigenBase< OtherDerived > &linear) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a62a95caa45e0aa178e0b2759c78874b1',1,'Eigen::Translation::operator*(const MatrixBase< Derived > &vec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a37840d7fa515418e143593efbd21c6b3',1,'Eigen::Translation::operator*(const RotationBase< Derived, Dim > &r) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#ac0e625c8d90f899be9c73b77592a003f',1,'Eigen::Translation::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#aa79f1217e27556e0524260e172a0b081',1,'Eigen::Translation::operator*(const Translation &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a156c8003ff3830756727e805cf98c0ab',1,'Eigen::Translation::operator*(const UniformScaling< Scalar > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#ad21c964c4d5dff8aa496558ef74731f1',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a8abd57298d10bd620bdfc459d22e8add',1,'Eigen::UniformScaling::operator*(const MatrixBase< Derived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#ad8c9401526e9ade727036b6d255fbdc0',1,'Eigen::UniformScaling::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a19c405341f2c861eb0ddfc4f760fecf8',1,'Eigen::UniformScaling::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#af3044cffe5703a1946c33a953b0f9bb6',1,'Eigen::UniformScaling::operator*(const UniformScaling &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a8f79e131479dbe709ee1173b1be9a8f0',1,'Eigen::UniformScaling::operator*(const MatrixBase< Derived > &matrix, const UniformScaling< Scalar > &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'Eigen::VectorwiseOp::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Derived, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Derived, Vertical >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator*()'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gac57f9a35a5d4d1d3ba23d7871113cbd3',1,'cv::operator*(const Affine3< T > &affine1, const Affine3< T > &affine2)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gae9c102e6fd783bcf801e3432aca22e7b',1,'cv::operator*(const Affine3< T > &affine, const V &vector)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga548eb6a25623179405f13cad3954c01e',1,'cv::operator*(const Affine3f &affine, const Vec3f &vector)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaa607fd3c66c5c525cc4d39dc83ffd177',1,'cv::operator*(const Affine3d &affine, const Vec3d &vector)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga902a09c161f9ef0eedcf1414e58f3672',1,'cv::operator*(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487b453f9836d06d7324744d40dad0b',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6515905db0f226f4645878f458e4ff9',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf583d2c1fcd51d86094e1f30b2a58a2',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e1bad5a79815eec73d07827b885d1cd',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f79b898d0d82738072b4c49ef4086',1,'cv::cudev::operator*(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5a0a9a53dee95c42e80578e6440b218',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf27cecd7f8e200f4de479660583a8d15',1,'cv::cudev::operator*(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7f8cfe1eaafe131a814ee152b9a6e5a',1,'cv::cudev::operator*(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12aeb64e97cdb928290bf3fa82f05269',1,'cv::cudev::operator*(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fa7f2aa7dd5048da167a76587a44028',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93118d92ecb3c188a5c01ba769ba299e',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1a615302d17eda49ad2cec76c41859',1,'cv::cudev::operator*(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca535315088057b26c801a5705c1483',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510f2b0f9088282d3d47bf3093a38f78',1,'cv::cudev::operator*(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga163edd6ad357b0a6b49d3ad55b84f88c',1,'cv::cudev::operator*(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c75809716911fce2e047b0fb0c984b',1,'cv::cudev::operator*(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9db0eb6fb6dacf76ef4e8c8c304ddd9c',1,'cv::cudev::operator*(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b5811bca4633d9a78a6cae2adfa3dff',1,'cv::cudev::operator*(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafda944b16459e9a69661d33e7607fb41',1,'cv::cudev::operator*(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c7c955caf1909eb3c94363e1c7d3cb5',1,'cv::cudev::operator*(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4aaeb25bb41c3e4d44a51b4930532426',1,'cv::cudev::operator*(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43ee6bae7bda7ed2faf47b555790cb71',1,'cv::cudev::operator*(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02baabd5114aa4d102ed246afc6ce624',1,'cv::cudev::operator*(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga090d742c550d7e79878be81be9bdb2d2',1,'cv::cudev::operator*(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18a1ba838a8be508e64a43158cc45dfb',1,'cv::cudev::operator*(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e14d050010ca7c994471bf8467e32d3',1,'cv::cudev::operator*(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d7b1523f9c29c8a05ad2e41f191a2fe',1,'cv::cudev::operator*(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa1246b30b73eb70bba00a86fcd66395',1,'cv::cudev::operator*(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba88bd93ccad1c92db994fe051e342b',1,'cv::cudev::operator*(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98f94ba39b97b682e67464d85209e95',1,'cv::cudev::operator*(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84372ff1d3b6a2526b19964595096039',1,'cv::cudev::operator*(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3cc2c07d0405e5bef08000f75eb39e8',1,'cv::cudev::operator*(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c697c1a0f04f6e63a5f9da4ac327e85',1,'cv::cudev::operator*(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc87fb00c079b8edcfccd10ab13af8d2',1,'cv::cudev::operator*(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf59a024579c49c38a26a8a27e58297c1',1,'cv::cudev::operator*(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf912af0788d82a8d5aff820aaa99059',1,'cv::cudev::operator*(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88c3308c7efb95649564d8be2691284d',1,'cv::cudev::operator*(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb953af5f4125ba0182c6f8917300f90',1,'cv::cudev::operator*(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac65246dd4280d78429ab84b3fc9c2870',1,'cv::cudev::operator*(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f3e6aea5eb84905c559ef24412fa56',1,'cv::cudev::operator*(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga414e54087adc42f28fa754230dbab979',1,'cv::cudev::operator*(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac2d56a48c008a7e47b6310b109b376e',1,'cv::cudev::operator*(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d7b82717c159efcaadead58ee8142a8',1,'cv::cudev::operator*(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe5bfda78209600b7280b4bbd3cc3762',1,'cv::cudev::operator*(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae528d51efc3d013a608832c80bed2f8c',1,'cv::cudev::operator*(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga849d54a360b19427092bd7ce395da7c5',1,'cv::cudev::operator*(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f187e66cff592d0712ceaaa605e038',1,'cv::cudev::operator*(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac0afe2a5142d8098d2482c3814f8671',1,'cv::cudev::operator*(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5a08e2ac528655b1571f7fcb28c3c0',1,'cv::cudev::operator*(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5333891f8e975c6bc4e8f5813545b4b',1,'cv::cudev::operator*(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a3078c6a237576551f2d32606e32f10',1,'cv::cudev::operator*(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed7245cd9d9405b2de08c4b21fa08a5',1,'cv::cudev::operator*(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc381907b598468405b30d25a06c8ff',1,'cv::cudev::operator*(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e97c44127431ce49735fa92dbe4b25f',1,'cv::cudev::operator*(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9424ca0c0b214254e9adecb61adb2e5a',1,'cv::cudev::operator*(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae410ccbe1a6a58649302ccebf3c68949',1,'cv::cudev::operator*(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3b2a2d0d9a613d056c8523e155b674c',1,'cv::cudev::operator*(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85f5cd22ec760e4a2c14c78d80f4670d',1,'cv::cudev::operator*(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37e9268a08593a1e1bb839e2ce50ede9',1,'cv::cudev::operator*(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2429e2ed1796030785a93567ecf1776f',1,'cv::cudev::operator*(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1c28bd26127b812ce97c907b32fc9fc',1,'cv::cudev::operator*(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9cc4a289ee92829765bdf1958bc6e05',1,'cv::cudev::operator*(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e8f6dbe9d17cbd6cf04375fc5fca9ae',1,'cv::cudev::operator*(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f2fa27b61586fef88ab71db6e08faf0',1,'cv::cudev::operator*(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf9988841348e5856a943b777002e2b',1,'cv::cudev::operator*(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b8a526c1994b95e9ce76e3614acc86',1,'cv::cudev::operator*(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23920ad7c06382a913e3fcf217459a0b',1,'cv::cudev::operator*(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e9ba42884866db4b183e9028fd8b04f',1,'cv::cudev::operator*(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf5b25603db42e2eb11c8fdd17a7f25f',1,'cv::cudev::operator*(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c10d68845ebb0598810e51a2eba805c',1,'cv::cudev::operator*(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65f2d1823549a4b6dc52ef6d3054ba56',1,'cv::cudev::operator*(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1f3d4142ff834d438ef16a84fb23355',1,'cv::cudev::operator*(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fcd3e4a9f5ffcb684e3945e713a190f',1,'cv::cudev::operator*(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3caace9001357c38394f006fb1f634a',1,'cv::cudev::operator*(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2076958e894ca52570151a2308d8c781',1,'cv::cudev::operator*(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2741381920372f76817c4b9b76e28137',1,'cv::cudev::operator*(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2394ee2867506f375e14a36018519d8a',1,'cv::cudev::operator*(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6028638b717b193d90a9bbdd76a2797',1,'cv::cudev::operator*(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf250948634b71efc0820d731faa6cda1',1,'cv::cudev::operator*(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc861ca7430feace92266e538ed54b24',1,'cv::cudev::operator*(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08650b887f60c9a6c242c79f09c0cb69',1,'cv::cudev::operator*(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5522c68d2ae330209abc2765d6b50992',1,'cv::cudev::operator*(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacef4b96ed094bbed58d13a7071d1a87a',1,'cv::cudev::operator*(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5bd92d93ed5dbf9714a033550a83ed',1,'cv::cudev::operator*(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac18603d03fbcfdfd23751709f2238029',1,'cv::cudev::operator*(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5afec7fb5b0492668e86c8181f441aa',1,'cv::cudev::operator*(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2943f13db2702fddce4557a2e957c565',1,'cv::cudev::operator*(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32454c9d98afba5f7144a92cd6bf5acb',1,'cv::cudev::operator*(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16a1d022b4026918e85eaf28ac606a81',1,'cv::cudev::operator*(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8c6dcb676ea367c9e1dd89fd4f0abf4',1,'cv::cudev::operator*(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27de604fa033669bc0555199b31ef777',1,'cv::cudev::operator*(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1edec141c59b8a684d2592d1420949a1',1,'cv::cudev::operator*(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07a0d9f472b1baec9f5eabfff9d1eaf7',1,'cv::cudev::operator*(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6be4a7723c490f8b150c714436100e12',1,'cv::cudev::operator*(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddd96b00b4b034d26ce474707a4e5e1d',1,'cv::cudev::operator*(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7ef727c5051a2421616f0517740d984',1,'cv::cudev::operator*(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11b210a1793cf8e3d930c11dfda9ae6e',1,'cv::cudev::operator*(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55db9f51fac5b573deb32220a631ca9',1,'cv::cudev::operator*(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28a4888db08301e51da23d006f382653',1,'cv::cudev::operator*(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7020c56e082be84fca69fa2c9916a4e',1,'cv::cudev::operator*(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c25ca47380b7997200bb81a88f0323',1,'cv::cudev::operator*(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7b92c373c28a5c4e44617cbbe8b28d8',1,'cv::cudev::operator*(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dff9b27265d9a0d0b246618c2f6d190',1,'cv::cudev::operator*(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e7e1c4649f286432072ebf0bbcaa069',1,'cv::cudev::operator*(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98148cbe18fa5a1fe9cc37af9b2944da',1,'cv::cudev::operator*(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8af39ddbfd14cda64dc1ea8312ddeaab',1,'cv::cudev::operator*(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25a1baeb7c9b07639b599dcafb0a7dd1',1,'cv::cudev::operator*(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cfca580e4aed7f30b018f5b3b5f04de',1,'cv::cudev::operator*(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28a09636e8ddc34502754ef3cc45736',1,'cv::cudev::operator*(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd4d86a80e9a8ba4d0b8191946a7c7e4',1,'cv::cudev::operator*(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga500f12286f4bde3313357ee9b77522d8',1,'cv::cudev::operator*(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b1789f57a51f5db4560fe91f26bbd1',1,'cv::cudev::operator*(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5723f7cf916b1c9455c8581abcdeb505',1,'cv::cudev::operator*(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0e897f09e26316ca2aa0cbb965e1835',1,'cv::cudev::operator*(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga314f5a0e14f5b478c6c979776c26d203',1,'cv::cudev::operator*(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819a0d444655998d3ae70cd93b283319',1,'cv::cudev::operator*(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a5340751b48d6b199875c361804465',1,'cv::cudev::operator*(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bce5ffd4058a6549f3bb651f50bfe46',1,'cv::cudev::operator*(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ca0ada3b453db74593720374e9af90f',1,'cv::cudev::operator*(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2228f02f69514b9ea9c3bd30df71d0',1,'cv::cudev::operator*(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f24178f4139fa88be47e2b9f7126eb',1,'cv::cudev::operator*(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82ad067165475e005f75eb902cbcf2f6',1,'cv::cudev::operator*(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eca4d9d17555bb68127757943e54495',1,'cv::cudev::operator*(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddaa9f9bc413848a741a108556de7f66',1,'cv::cudev::operator*(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d937bc5dd036bbbc645b81f260b5b5',1,'cv::cudev::operator*(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3cce3391058528e77d01b2f2aaf28f4',1,'cv::cudev::operator*(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd32b6bf1571865c29d46f1ac091c5d',1,'cv::cudev::operator*(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09b06dc7f40394668ea338909fdb11da',1,'cv::cudev::operator*(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2561dcb50f1b343e79d929c85d9d6af2',1,'cv::cudev::operator*(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab96739276183d3d037db1b31b54f98cb',1,'cv::cudev::operator*(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bc8a2714623a07f6d32a01c5a02a19d',1,'cv::cudev::operator*(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e546e55ec80d5ce6e41dd72c8091ad7',1,'cv::cudev::operator*(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0f13827bf653baef99ce65166394e7f',1,'cv::cudev::operator*(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19620047188467d968634de432862b30',1,'cv::cudev::operator*(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9f8c286132b32a1d0d2f136b9304e9f',1,'cv::cudev::operator*(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89bebd81801426221358914f44b9399f',1,'cv::cudev::operator*(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad909b1577d5bc471b8ebc7d934253736',1,'cv::cudev::operator*(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ddea16553b01373469d460fd8f5f9',1,'cv::cudev::operator*(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd372b32bcd38be3dd4261d657c742fa',1,'cv::cudev::operator*(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e03853be024cf4a58640b575d7b6122',1,'cv::cudev::operator*(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b0ea30f8320cf30ca3b42aa699e1d11',1,'cv::cudev::operator*(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4976047aad73ae11f14d5311b5efc643',1,'cv::cudev::operator*(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d268df51117be47d5a192550113b2bb',1,'cv::cudev::operator*(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga886827c0f13b44c8fa578f3d4bab6187',1,'cv::cudev::operator*(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06546a623ef3a0292e0d0b5b9a241596',1,'cv::cudev::operator*(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f215d83712628eb64664ca8edc729c3',1,'cv::cudev::operator*(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322e5725d39b6a56b10217744fd54c84',1,'cv::cudev::operator*(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ca17de0407d90a3cac404220b157d5',1,'cv::cudev::operator*(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac169dc02de88236dc3287630549e7c32',1,'cv::cudev::operator*(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d60d4ea2cc22ce5ae0cf0950b2148dd',1,'cv::cudev::operator*(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95b4ecd54e292812be0faf0a93687fa5',1,'cv::cudev::operator*(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9246aa07ab9cb8d3a42db71f45d804a',1,'cv::cudev::operator*(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed19b40b852d4b05f7af20906f02df96',1,'cv::cudev::operator*(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa8c599bd31954a5687b8a1ae2ba1696',1,'cv::cudev::operator*(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ea6d03ee2c62f728d3fbfe71f16b259',1,'cv::cudev::operator*(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dabe0e00519ed1f069e7682e7dc28d2',1,'cv::cudev::operator*(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga916d16970792f1444932d3551460e762',1,'cv::cudev::operator*(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0acc20bf74d011ff6eb0263efa31c91',1,'cv::cudev::operator*(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacea516a696d7e15b81d71bc335a1be2b',1,'cv::cudev::operator*(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67e2f781ad85fbc5b4b2759018ef0bc',1,'cv::cudev::operator*(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cee4b43501cb0d54db315a9be3c00be',1,'cv::cudev::operator*(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eb8ba99e7883f7e5208da1d56a63ea8',1,'cv::cudev::operator*(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd127c751ea3d9b32c47a50503405eaa',1,'cv::cudev::operator*(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea8d0ec3ad321a074118524061e9de9b',1,'cv::cudev::operator*(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae972a64880e7f11f0b512bf4862c988d',1,'cv::cudev::operator*(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae7124c60811e471f4ccea775e6a8105',1,'cv::cudev::operator*(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefcfe41bdbb40358a627620664e43087',1,'cv::cudev::operator*(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga532206b6078098de41bdb7cdee843242',1,'cv::cudev::operator*(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6dde37f01013af843248fa57df5a4705',1,'cv::cudev::operator*(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d83c6f1c934d58b0db96fb9b1031e4',1,'cv::cudev::operator*(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0555787fcd7d58a8c94d0a4369c947',1,'cv::cudev::operator*(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5305d06b4d7893f8d4fb352f6941d49',1,'cv::cudev::operator*(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbccb0f7cfedd9faa5375d17e7acd9e6',1,'cv::cudev::operator*(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d713228fed5e4b46d913ee514c4702',1,'cv::cudev::operator*(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga416c75338bba0071cde9be85bdd14c8f',1,'cv::cudev::operator*(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c4bf653481daa71869c6ec80f7ac7c',1,'cv::cudev::operator*(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62bf09c0d8b2a28f9de71abb998ab55f',1,'cv::cudev::operator*(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e873b6129892d4d634e0b541aa5a356',1,'cv::cudev::operator*(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db9280a8455e340346203f8c8dbc45d',1,'cv::cudev::operator*(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bfdc89f82d9717003387c1d237f5923',1,'cv::cudev::operator*(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f86fba4880a36b6a7bd2394e161b34',1,'cv::cudev::operator*(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f952a21290dc2760de145e020239a6',1,'cv::cudev::operator*(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga530e3a25447a5113790059cf574c9d4d',1,'cv::cudev::operator*(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga939ac4107ae2ef44cdba119f11a3e41b',1,'cv::cudev::operator*(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa226675e3d5fa565377951e1fe2adf26',1,'cv::cudev::operator*(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga032a606b459e22962751c5b5cb56721c',1,'cv::cudev::operator*(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42182588882947c6d2ea60418ccfa53f',1,'cv::cudev::operator*(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657fd69c2c2dbaa5bbd8f38e9086600c',1,'cv::cudev::operator*(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga913025bdda9cfaf0a1d39fe6f912d32e',1,'cv::cudev::operator*(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcfcf7d4b858ae3c794028e7c55b20a',1,'cv::cudev::operator*(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b854a847e119bfbc02c2cc5de31787',1,'cv::cudev::operator*(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb615b962e904782d9555a089708366d',1,'cv::cudev::operator*(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b093cf980d6cabad1afbc4954ce86f9',1,'cv::cudev::operator*(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0613453550f4199c8fe8734f2e7ef4cb',1,'cv::cudev::operator*(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb4e9c2226edb173d19a520c69297f57',1,'cv::cudev::operator*(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a441729d11f327aa925f6980920c810',1,'cv::cudev::operator*(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c93c9c99656ffb2dcd5abda39efae1d',1,'cv::cudev::operator*(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b2fee3c015fbd9323b9951b595639f0',1,'cv::cudev::operator*(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1881d24ddb09d043dcd7c859e61b16',1,'cv::cudev::operator*(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c0fa10b8bed67d42ab55dc2208107f8',1,'cv::cudev::operator*(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga027915df6e568365ecfa3e12a5e677f4',1,'cv::cudev::operator*(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58bcfcef533a71a0a1a9ee50738d257c',1,'cv::cudev::operator*(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5920528b65944ed40e4497447d8e0316',1,'cv::cudev::operator*(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44418d16b815d5057b17b2a34246734c',1,'cv::cudev::operator*(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d29745317c743241a4d85cedc91bf88',1,'cv::cudev::operator*(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cbf71951b93eea0b5a076f7d18a7451',1,'cv::cudev::operator*(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e048d5a2db1da9b1575aebd01b047bb',1,'cv::cudev::operator*(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga663d40c6e2002f25c436d52d82b2c690',1,'cv::cudev::operator*(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7bd29f68c70d0a3b1b705f889140d0e',1,'cv::cudev::operator*(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4030fb67021c4472688f397dc551adb',1,'cv::cudev::operator*(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3476d190ac862ed33f50e5178938f6a',1,'cv::cudev::operator*(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04af26fcf72bcf1ea89a3406eb81dc56',1,'cv::cudev::operator*(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01861575c1321bb4e37ba4ff91b8f7dc',1,'cv::cudev::operator*(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9601e46278afcfaa677985f801a57d76',1,'cv::cudev::operator*(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab805b6e07f01115a8e08afa3108525',1,'cv::cudev::operator*(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a3751f548f681546118362181963dae',1,'cv::cudev::operator*(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8075bb13162203e07a2b9276b42aa063',1,'cv::cudev::operator*(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f7ee241d6ee1a6a20c735286770c6f',1,'cv::cudev::operator*(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga789c8bfcf46261d2c0c69901bfc53c61',1,'cv::cudev::operator*(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33a577374fa11cf0c7d9debceed5d70b',1,'cv::cudev::operator*(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab14d1e659db18b0c671ca9dbf9e0048f',1,'cv::cudev::operator*(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfad4cd4b1abf7ed115e9261d4fafaf1',1,'cv::cudev::operator*(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95434e47c47ea25a3a6d9f1906258286',1,'cv::cudev::operator*(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66aff7a10720233331180655c8be700d',1,'cv::cudev::operator*(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gac57f9a35a5d4d1d3ba23d7871113cbd3',1,'operator*(const Affine3< T > &affine1, const Affine3< T > &affine2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gae9c102e6fd783bcf801e3432aca22e7b',1,'operator*(const Affine3< T > &affine, const V &vector)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga548eb6a25623179405f13cad3954c01e',1,'operator*(const Affine3f &affine, const Vec3f &vector)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaa607fd3c66c5c525cc4d39dc83ffd177',1,'operator*(const Affine3d &affine, const Vec3d &vector)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab2ccc99b90013df8b9cf49f6c63842ff',1,'operator*(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac2116f5bce2914d578953c6ac8c0da16',1,'operator*(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga902a09c161f9ef0eedcf1414e58f3672',1,'operator*(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487b453f9836d06d7324744d40dad0b',1,'operator*(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6515905db0f226f4645878f458e4ff9',1,'operator*(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf583d2c1fcd51d86094e1f30b2a58a2',1,'operator*(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e1bad5a79815eec73d07827b885d1cd',1,'operator*(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f79b898d0d82738072b4c49ef4086',1,'operator*(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5a0a9a53dee95c42e80578e6440b218',1,'operator*(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf27cecd7f8e200f4de479660583a8d15',1,'operator*(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7f8cfe1eaafe131a814ee152b9a6e5a',1,'operator*(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12aeb64e97cdb928290bf3fa82f05269',1,'operator*(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fa7f2aa7dd5048da167a76587a44028',1,'operator*(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93118d92ecb3c188a5c01ba769ba299e',1,'operator*(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1a615302d17eda49ad2cec76c41859',1,'operator*(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca535315088057b26c801a5705c1483',1,'operator*(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510f2b0f9088282d3d47bf3093a38f78',1,'operator*(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga163edd6ad357b0a6b49d3ad55b84f88c',1,'operator*(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c75809716911fce2e047b0fb0c984b',1,'operator*(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9db0eb6fb6dacf76ef4e8c8c304ddd9c',1,'operator*(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b5811bca4633d9a78a6cae2adfa3dff',1,'operator*(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafda944b16459e9a69661d33e7607fb41',1,'operator*(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c7c955caf1909eb3c94363e1c7d3cb5',1,'operator*(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4aaeb25bb41c3e4d44a51b4930532426',1,'operator*(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43ee6bae7bda7ed2faf47b555790cb71',1,'operator*(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02baabd5114aa4d102ed246afc6ce624',1,'operator*(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga090d742c550d7e79878be81be9bdb2d2',1,'operator*(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18a1ba838a8be508e64a43158cc45dfb',1,'operator*(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e14d050010ca7c994471bf8467e32d3',1,'operator*(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d7b1523f9c29c8a05ad2e41f191a2fe',1,'operator*(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa1246b30b73eb70bba00a86fcd66395',1,'operator*(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba88bd93ccad1c92db994fe051e342b',1,'operator*(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98f94ba39b97b682e67464d85209e95',1,'operator*(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84372ff1d3b6a2526b19964595096039',1,'operator*(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3cc2c07d0405e5bef08000f75eb39e8',1,'operator*(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c697c1a0f04f6e63a5f9da4ac327e85',1,'operator*(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc87fb00c079b8edcfccd10ab13af8d2',1,'operator*(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf59a024579c49c38a26a8a27e58297c1',1,'operator*(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf912af0788d82a8d5aff820aaa99059',1,'operator*(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88c3308c7efb95649564d8be2691284d',1,'operator*(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb953af5f4125ba0182c6f8917300f90',1,'operator*(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac65246dd4280d78429ab84b3fc9c2870',1,'operator*(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f3e6aea5eb84905c559ef24412fa56',1,'operator*(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga414e54087adc42f28fa754230dbab979',1,'operator*(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac2d56a48c008a7e47b6310b109b376e',1,'operator*(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d7b82717c159efcaadead58ee8142a8',1,'operator*(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe5bfda78209600b7280b4bbd3cc3762',1,'operator*(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae528d51efc3d013a608832c80bed2f8c',1,'operator*(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga849d54a360b19427092bd7ce395da7c5',1,'operator*(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f187e66cff592d0712ceaaa605e038',1,'operator*(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac0afe2a5142d8098d2482c3814f8671',1,'operator*(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5a08e2ac528655b1571f7fcb28c3c0',1,'operator*(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5333891f8e975c6bc4e8f5813545b4b',1,'operator*(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a3078c6a237576551f2d32606e32f10',1,'operator*(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed7245cd9d9405b2de08c4b21fa08a5',1,'operator*(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc381907b598468405b30d25a06c8ff',1,'operator*(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e97c44127431ce49735fa92dbe4b25f',1,'operator*(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9424ca0c0b214254e9adecb61adb2e5a',1,'operator*(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae410ccbe1a6a58649302ccebf3c68949',1,'operator*(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3b2a2d0d9a613d056c8523e155b674c',1,'operator*(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85f5cd22ec760e4a2c14c78d80f4670d',1,'operator*(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37e9268a08593a1e1bb839e2ce50ede9',1,'operator*(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2429e2ed1796030785a93567ecf1776f',1,'operator*(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1c28bd26127b812ce97c907b32fc9fc',1,'operator*(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9cc4a289ee92829765bdf1958bc6e05',1,'operator*(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e8f6dbe9d17cbd6cf04375fc5fca9ae',1,'operator*(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f2fa27b61586fef88ab71db6e08faf0',1,'operator*(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf9988841348e5856a943b777002e2b',1,'operator*(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b8a526c1994b95e9ce76e3614acc86',1,'operator*(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23920ad7c06382a913e3fcf217459a0b',1,'operator*(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e9ba42884866db4b183e9028fd8b04f',1,'operator*(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf5b25603db42e2eb11c8fdd17a7f25f',1,'operator*(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c10d68845ebb0598810e51a2eba805c',1,'operator*(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65f2d1823549a4b6dc52ef6d3054ba56',1,'operator*(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1f3d4142ff834d438ef16a84fb23355',1,'operator*(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fcd3e4a9f5ffcb684e3945e713a190f',1,'operator*(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3caace9001357c38394f006fb1f634a',1,'operator*(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2076958e894ca52570151a2308d8c781',1,'operator*(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2741381920372f76817c4b9b76e28137',1,'operator*(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2394ee2867506f375e14a36018519d8a',1,'operator*(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6028638b717b193d90a9bbdd76a2797',1,'operator*(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf250948634b71efc0820d731faa6cda1',1,'operator*(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc861ca7430feace92266e538ed54b24',1,'operator*(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08650b887f60c9a6c242c79f09c0cb69',1,'operator*(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5522c68d2ae330209abc2765d6b50992',1,'operator*(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacef4b96ed094bbed58d13a7071d1a87a',1,'operator*(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5bd92d93ed5dbf9714a033550a83ed',1,'operator*(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac18603d03fbcfdfd23751709f2238029',1,'operator*(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5afec7fb5b0492668e86c8181f441aa',1,'operator*(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2943f13db2702fddce4557a2e957c565',1,'operator*(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32454c9d98afba5f7144a92cd6bf5acb',1,'operator*(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16a1d022b4026918e85eaf28ac606a81',1,'operator*(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8c6dcb676ea367c9e1dd89fd4f0abf4',1,'operator*(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27de604fa033669bc0555199b31ef777',1,'operator*(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1edec141c59b8a684d2592d1420949a1',1,'operator*(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07a0d9f472b1baec9f5eabfff9d1eaf7',1,'operator*(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6be4a7723c490f8b150c714436100e12',1,'operator*(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddd96b00b4b034d26ce474707a4e5e1d',1,'operator*(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7ef727c5051a2421616f0517740d984',1,'operator*(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11b210a1793cf8e3d930c11dfda9ae6e',1,'operator*(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55db9f51fac5b573deb32220a631ca9',1,'operator*(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28a4888db08301e51da23d006f382653',1,'operator*(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7020c56e082be84fca69fa2c9916a4e',1,'operator*(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c25ca47380b7997200bb81a88f0323',1,'operator*(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7b92c373c28a5c4e44617cbbe8b28d8',1,'operator*(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dff9b27265d9a0d0b246618c2f6d190',1,'operator*(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e7e1c4649f286432072ebf0bbcaa069',1,'operator*(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98148cbe18fa5a1fe9cc37af9b2944da',1,'operator*(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8af39ddbfd14cda64dc1ea8312ddeaab',1,'operator*(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25a1baeb7c9b07639b599dcafb0a7dd1',1,'operator*(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cfca580e4aed7f30b018f5b3b5f04de',1,'operator*(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28a09636e8ddc34502754ef3cc45736',1,'operator*(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd4d86a80e9a8ba4d0b8191946a7c7e4',1,'operator*(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga500f12286f4bde3313357ee9b77522d8',1,'operator*(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b1789f57a51f5db4560fe91f26bbd1',1,'operator*(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5723f7cf916b1c9455c8581abcdeb505',1,'operator*(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0e897f09e26316ca2aa0cbb965e1835',1,'operator*(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga314f5a0e14f5b478c6c979776c26d203',1,'operator*(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819a0d444655998d3ae70cd93b283319',1,'operator*(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a5340751b48d6b199875c361804465',1,'operator*(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bce5ffd4058a6549f3bb651f50bfe46',1,'operator*(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ca0ada3b453db74593720374e9af90f',1,'operator*(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2228f02f69514b9ea9c3bd30df71d0',1,'operator*(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f24178f4139fa88be47e2b9f7126eb',1,'operator*(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82ad067165475e005f75eb902cbcf2f6',1,'operator*(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eca4d9d17555bb68127757943e54495',1,'operator*(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddaa9f9bc413848a741a108556de7f66',1,'operator*(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d937bc5dd036bbbc645b81f260b5b5',1,'operator*(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3cce3391058528e77d01b2f2aaf28f4',1,'operator*(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd32b6bf1571865c29d46f1ac091c5d',1,'operator*(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09b06dc7f40394668ea338909fdb11da',1,'operator*(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2561dcb50f1b343e79d929c85d9d6af2',1,'operator*(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab96739276183d3d037db1b31b54f98cb',1,'operator*(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bc8a2714623a07f6d32a01c5a02a19d',1,'operator*(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e546e55ec80d5ce6e41dd72c8091ad7',1,'operator*(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0f13827bf653baef99ce65166394e7f',1,'operator*(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19620047188467d968634de432862b30',1,'operator*(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9f8c286132b32a1d0d2f136b9304e9f',1,'operator*(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89bebd81801426221358914f44b9399f',1,'operator*(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad909b1577d5bc471b8ebc7d934253736',1,'operator*(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ddea16553b01373469d460fd8f5f9',1,'operator*(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd372b32bcd38be3dd4261d657c742fa',1,'operator*(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e03853be024cf4a58640b575d7b6122',1,'operator*(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b0ea30f8320cf30ca3b42aa699e1d11',1,'operator*(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4976047aad73ae11f14d5311b5efc643',1,'operator*(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d268df51117be47d5a192550113b2bb',1,'operator*(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga886827c0f13b44c8fa578f3d4bab6187',1,'operator*(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06546a623ef3a0292e0d0b5b9a241596',1,'operator*(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f215d83712628eb64664ca8edc729c3',1,'operator*(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322e5725d39b6a56b10217744fd54c84',1,'operator*(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ca17de0407d90a3cac404220b157d5',1,'operator*(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac169dc02de88236dc3287630549e7c32',1,'operator*(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d60d4ea2cc22ce5ae0cf0950b2148dd',1,'operator*(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95b4ecd54e292812be0faf0a93687fa5',1,'operator*(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9246aa07ab9cb8d3a42db71f45d804a',1,'operator*(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed19b40b852d4b05f7af20906f02df96',1,'operator*(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa8c599bd31954a5687b8a1ae2ba1696',1,'operator*(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ea6d03ee2c62f728d3fbfe71f16b259',1,'operator*(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dabe0e00519ed1f069e7682e7dc28d2',1,'operator*(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga916d16970792f1444932d3551460e762',1,'operator*(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0acc20bf74d011ff6eb0263efa31c91',1,'operator*(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacea516a696d7e15b81d71bc335a1be2b',1,'operator*(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67e2f781ad85fbc5b4b2759018ef0bc',1,'operator*(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cee4b43501cb0d54db315a9be3c00be',1,'operator*(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eb8ba99e7883f7e5208da1d56a63ea8',1,'operator*(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd127c751ea3d9b32c47a50503405eaa',1,'operator*(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea8d0ec3ad321a074118524061e9de9b',1,'operator*(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae972a64880e7f11f0b512bf4862c988d',1,'operator*(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae7124c60811e471f4ccea775e6a8105',1,'operator*(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefcfe41bdbb40358a627620664e43087',1,'operator*(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga532206b6078098de41bdb7cdee843242',1,'operator*(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6dde37f01013af843248fa57df5a4705',1,'operator*(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d83c6f1c934d58b0db96fb9b1031e4',1,'operator*(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0555787fcd7d58a8c94d0a4369c947',1,'operator*(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5305d06b4d7893f8d4fb352f6941d49',1,'operator*(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbccb0f7cfedd9faa5375d17e7acd9e6',1,'operator*(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d713228fed5e4b46d913ee514c4702',1,'operator*(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga416c75338bba0071cde9be85bdd14c8f',1,'operator*(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c4bf653481daa71869c6ec80f7ac7c',1,'operator*(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62bf09c0d8b2a28f9de71abb998ab55f',1,'operator*(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e873b6129892d4d634e0b541aa5a356',1,'operator*(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db9280a8455e340346203f8c8dbc45d',1,'operator*(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bfdc89f82d9717003387c1d237f5923',1,'operator*(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f86fba4880a36b6a7bd2394e161b34',1,'operator*(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f952a21290dc2760de145e020239a6',1,'operator*(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga530e3a25447a5113790059cf574c9d4d',1,'operator*(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga939ac4107ae2ef44cdba119f11a3e41b',1,'operator*(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa226675e3d5fa565377951e1fe2adf26',1,'operator*(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga032a606b459e22962751c5b5cb56721c',1,'operator*(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42182588882947c6d2ea60418ccfa53f',1,'operator*(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657fd69c2c2dbaa5bbd8f38e9086600c',1,'operator*(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga913025bdda9cfaf0a1d39fe6f912d32e',1,'operator*(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcfcf7d4b858ae3c794028e7c55b20a',1,'operator*(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b854a847e119bfbc02c2cc5de31787',1,'operator*(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb615b962e904782d9555a089708366d',1,'operator*(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b093cf980d6cabad1afbc4954ce86f9',1,'operator*(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0613453550f4199c8fe8734f2e7ef4cb',1,'operator*(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb4e9c2226edb173d19a520c69297f57',1,'operator*(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a441729d11f327aa925f6980920c810',1,'operator*(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c93c9c99656ffb2dcd5abda39efae1d',1,'operator*(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b2fee3c015fbd9323b9951b595639f0',1,'operator*(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1881d24ddb09d043dcd7c859e61b16',1,'operator*(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c0fa10b8bed67d42ab55dc2208107f8',1,'operator*(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga027915df6e568365ecfa3e12a5e677f4',1,'operator*(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58bcfcef533a71a0a1a9ee50738d257c',1,'operator*(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5920528b65944ed40e4497447d8e0316',1,'operator*(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44418d16b815d5057b17b2a34246734c',1,'operator*(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d29745317c743241a4d85cedc91bf88',1,'operator*(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cbf71951b93eea0b5a076f7d18a7451',1,'operator*(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e048d5a2db1da9b1575aebd01b047bb',1,'operator*(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga663d40c6e2002f25c436d52d82b2c690',1,'operator*(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7bd29f68c70d0a3b1b705f889140d0e',1,'operator*(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4030fb67021c4472688f397dc551adb',1,'operator*(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3476d190ac862ed33f50e5178938f6a',1,'operator*(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04af26fcf72bcf1ea89a3406eb81dc56',1,'operator*(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01861575c1321bb4e37ba4ff91b8f7dc',1,'operator*(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9601e46278afcfaa677985f801a57d76',1,'operator*(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab805b6e07f01115a8e08afa3108525',1,'operator*(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a3751f548f681546118362181963dae',1,'operator*(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8075bb13162203e07a2b9276b42aa063',1,'operator*(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f7ee241d6ee1a6a20c735286770c6f',1,'operator*(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga789c8bfcf46261d2c0c69901bfc53c61',1,'operator*(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33a577374fa11cf0c7d9debceed5d70b',1,'operator*(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab14d1e659db18b0c671ca9dbf9e0048f',1,'operator*(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfad4cd4b1abf7ed115e9261d4fafaf1',1,'operator*(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95434e47c47ea25a3a6d9f1906258286',1,'operator*(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66aff7a10720233331180655c8be700d',1,'operator*(double s, const double4 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga198533c477a87a54b78d348778d6a246',1,'std::operator*(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gadcae3a7fb5244e221cbab5efb79b56c4',1,'std::operator*(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga410ff39982a7970454bfe8e1ce7ddcf7',1,'std::operator*(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga198533c477a87a54b78d348778d6a246',1,'operator*(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gadcae3a7fb5244e221cbab5efb79b56c4',1,'operator*(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga410ff39982a7970454bfe8e1ce7ddcf7',1,'operator*(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad225313de8037d40c2d26c17edf1a9fd',1,'Eigen::operator*(const InverseImpl< PermutationType, PermutationStorage > &tperm, const SparseMatrixBase< SparseDerived > &matrix)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a9723b3ff0f2c99fe1081e3eb14380d4c',1,'Eigen::operator*(const MatrixBase< MatrixDerived > &matrix, const PermutationBase< PermutationDerived > &permutation)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a06ca1e6b1a30b4dd0f2633664fe4d956',1,'Eigen::operator*(const MatrixBase< MatrixDerived > &matrix, const TranspositionsBase< TranspositionsDerived > &transpositions)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a634bfd5e206a2e77f799b4c3956ea49e',1,'Eigen::operator*(const MatrixBase< OtherDerived > &other, const HouseholderSequence< VectorsType, CoeffsType, Side > &h)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a02fbb1bbd915b899b34a56a3cd64c438',1,'Eigen::operator*(const PermutationBase< PermDerived > &perm, const SparseMatrixBase< SparseDerived > &matrix)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a4d2abe28092f8070e971494c7e0b507a',1,'Eigen::operator*(const PermutationBase< PermutationDerived > &permutation, const MatrixBase< MatrixDerived > &matrix)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a8b7051d2f98498d619044089949f931d',1,'Eigen::operator*(const SparseMatrixBase< SparseDerived > &matrix, const InverseImpl< PermutationType, PermutationStorage > &tperm)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a429958a0e6bd27168f3935d3100c55cf',1,'Eigen::operator*(const SparseMatrixBase< SparseDerived > &matrix, const PermutationBase< PermDerived > &perm)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a02b783ce2d2464d4f4a0bc0d1dc494f0',1,'Eigen::operator*(const TranspositionsBase< TranspositionsDerived > &transpositions, const MatrixBase< MatrixDerived > &matrix)']]], - ['operator_2a_3d_107',['operator*=',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadfb86357bfb8cd27685582d3b7bb49ab',1,'cv::softdouble::operator*=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga412ec9d48b6f525b0ca44cfe4a2f12f9',1,'cv::softfloat::operator*=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'cv::Vec::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'cv::Vec::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 2 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 2 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 3 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 3 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 4 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 4 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 2 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 2 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 3 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 3 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga7bb2f4f7a2db97ebfa07181ba6435d1a',1,'std::complex::operator*=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaa495c7cb0718149e6a34650bc5ec4e1',1,'std::complex::operator*=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga84520c24cc0701e3f2bbeaea755e4aa2',1,'std::gslice_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac530f41a625a6f0842fc4fda0cb98189',1,'std::indirect_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga1878d8ab7ea54a42bbd783172af8a8c2',1,'std::mask_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2ae66c8e0229b65881780cb0dbd55ef8',1,'std::slice_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga345cd13171b5d52efb4979a1b3930ea6',1,'std::valarray::operator*=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab5a419c3673c284962634894e9c1fc20',1,'std::valarray::operator*=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga345cd13171b5d52efb4979a1b3930ea6',1,'valarray< size_t >::operator*=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab5a419c3673c284962634894e9c1fc20',1,'valarray< size_t >::operator*=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a6a5ff80e9d85106a1c9958219961c21d',1,'Eigen::ArrayBase::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a6a5ff80e9d85106a1c9958219961c21d',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3783b6168995ca117a1c19fea3630ac4',1,'Eigen::MatrixBase::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3783b6168995ca117a1c19fea3630ac4',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3783b6168995ca117a1c19fea3630ac4',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'Eigen::QuaternionBase::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a84fd39c79d4ca547ef0ff6c3c1dfcfcb',1,'Eigen::Rotation2D::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#adb13b29d664962dc3f62551644f11e87',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'Eigen::VectorwiseOp::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Derived, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Derived, Vertical >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator*=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gae3a0bf0a7afa1dd2d3f4390220fd0934',1,'cv::operator*=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga412ec9d48b6f525b0ca44cfe4a2f12f9',1,'operator*=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadfb86357bfb8cd27685582d3b7bb49ab',1,'operator*=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gae3a0bf0a7afa1dd2d3f4390220fd0934',1,'operator*=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga7bb2f4f7a2db97ebfa07181ba6435d1a',1,'operator*=(const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaa495c7cb0718149e6a34650bc5ec4e1',1,'operator*=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga84520c24cc0701e3f2bbeaea755e4aa2',1,'operator*=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga345cd13171b5d52efb4979a1b3930ea6',1,'operator*=(const _Tp &)(Global Namespace)']]], - ['operator_2b_108',['operator+',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a366cabf9cd5b9a9fb0e313570c5b3cac',1,'cv::MatExpr::operator+(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a93d7d34c3f0b5dbc5d6171d0a0094f28',1,'cv::MatExpr::operator+(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aefc08124af851c90433c85f39fb63a7e',1,'cv::MatExpr::operator+(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a503c5fe1e1f66590b35969fc28ba1af7',1,'cv::MatExpr::operator+(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab866e1c69c03008f2f9c0d923c4dc861',1,'cv::MatExpr::operator+(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a65604e00ecb411bef65e3c668a4bdf63',1,'cv::MatExpr::operator+(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac9b4c182fe91d94500d290beb8098345',1,'cv::MatExpr::operator+(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4f77f0a2048840246c7f219c5a06f2ff',1,'cv::MatExpr::operator+(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5d74e36027bfe69b2a50c7d5cc53752b',1,'cv::MatExpr::operator+(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9694cf1e4e9fe627f8b701cb9f97f2d0',1,'cv::MatExpr::operator+(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a366cabf9cd5b9a9fb0e313570c5b3cac',1,'cv::MatExpr::operator+(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a93d7d34c3f0b5dbc5d6171d0a0094f28',1,'cv::MatExpr::operator+(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aefc08124af851c90433c85f39fb63a7e',1,'cv::MatExpr::operator+(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a503c5fe1e1f66590b35969fc28ba1af7',1,'cv::MatExpr::operator+(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab866e1c69c03008f2f9c0d923c4dc861',1,'cv::MatExpr::operator+(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a65604e00ecb411bef65e3c668a4bdf63',1,'cv::MatExpr::operator+(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac9b4c182fe91d94500d290beb8098345',1,'cv::MatExpr::operator+(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4f77f0a2048840246c7f219c5a06f2ff',1,'cv::MatExpr::operator+(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5d74e36027bfe69b2a50c7d5cc53752b',1,'cv::MatExpr::operator+(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9694cf1e4e9fe627f8b701cb9f97f2d0',1,'cv::MatExpr::operator+(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'cv::Matx::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'cv::Matx::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< _Tp, cn, 1 >::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< _Tp, cn, 1 >::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 1, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 1, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 2 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 2 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 4, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 4, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, cn, 1 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, cn, 1 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 2, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 2, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 3, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 3, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, cn, 1 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, cn, 1 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float_type, 4, 4 >::operator+(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float_type, 4, 4 >::operator+(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gacf49831e844a094b21a41a37df2189e8',1,'cv::softdouble::operator+()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadb3c3fbb5bf49638bcaeddbfd16f3df7',1,'cv::softfloat::operator+()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'cv::Vec::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'cv::Vec::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< _Tp, 4 >::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< _Tp, 4 >::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 2 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 2 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 3 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 3 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 4 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 4 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 2 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 2 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 3 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 3 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a6719627d8f502c54e16f321d1790e030',1,'std::fpos::operator+()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a936c0491dbd3dfadfdbee626478b7009',1,'std::reverse_iterator::operator+()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga33a3a90827549220500c99f95b095816',1,'std::valarray::operator+()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga33a3a90827549220500c99f95b095816',1,'valarray< size_t >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'Eigen::VectorwiseOp::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Derived, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Derived, Vertical >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator+()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga9d4eb51e74c435420686e52b53d915a0',1,'cv::operator+()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga385a1836312404fd848a8f74b8ad7864',1,'cv::cudev::operator+(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0564f5e1dc7986e8b367e5e18d628cf9',1,'cv::cudev::operator+(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5751f0f9eea09af7d7be1a7ff9a6419',1,'cv::cudev::operator+(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4926bad3815b360be75781d8f789a299',1,'cv::cudev::operator+(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487522cfe2377387f941eb27b11052f0',1,'cv::cudev::operator+(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5318bd8d2d748d2c2f2e85cfa83f4174',1,'cv::cudev::operator+(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a593b2d7e5a664703a3189cfa3e8a2b',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga401671318958313b03cab9656be10333',1,'cv::cudev::operator+(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34588ecb09ba0f5b8bce1932b71ac2dc',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab32742b4d82dacbf5b03c3caaa21ad6a',1,'cv::cudev::operator+(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb808a69e62713677618f7e6aa6bad1c',1,'cv::cudev::operator+(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e85ea3a9090037ad78ba58f8d0635d1',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa545ec34a0a8d0b6b566d40d6b06be4',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88558d974e34b06012625b059582f84f',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ef3164d983c6c208fa7eae2d04e4901',1,'cv::cudev::operator+(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00e830af93185b0b0d9254abb4a3ba25',1,'cv::cudev::operator+(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga360059063d9c94f6895ad04c5538caa2',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab09d02dd9ae9cba4fff849e8cb4f011b',1,'cv::cudev::operator+(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaee9d8126772df36af785513ee3f33a0',1,'cv::cudev::operator+(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7809d9f6135f58240496734783a0d8e7',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa48ac783fc4d8c222edc3a5fee93d08',1,'cv::cudev::operator+(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1413eaa25988525f32e8b0c38588aca4',1,'cv::cudev::operator+(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31142062b4480b36487e1ceaf5001c60',1,'cv::cudev::operator+(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657e5172dce9285cd3450207c231ba91',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c965673b83d820595742fcba9d84ae6',1,'cv::cudev::operator+(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c140fc976d1e3b806105fbc841c5c8b',1,'cv::cudev::operator+(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87375c057e8e240da0620c8d30375fae',1,'cv::cudev::operator+(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f396374a8c6eaab38c438aa19f61953',1,'cv::cudev::operator+(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafadeec24b1b0d32d74f4bf66913a4961',1,'cv::cudev::operator+(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4626d73f4a41498ea009b0405b6fc58',1,'cv::cudev::operator+(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafec18ef79d72a4abcb395b55fa950ecc',1,'cv::cudev::operator+(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd70100577469c4b17877014098c321c',1,'cv::cudev::operator+(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga070cddd435b54d39dd9f53202de91e70',1,'cv::cudev::operator+(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65c78b19985aebe50cff55cb91091cb5',1,'cv::cudev::operator+(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a8be678d5c6d59577d013b1bc0f659a',1,'cv::cudev::operator+(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad505ddfe2b0b2efd85712ee4ee151ee',1,'cv::cudev::operator+(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa716696f351b72ed62b2eb9298e92431',1,'cv::cudev::operator+(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24687bb3a3f43d4cf77051b7f61c5bb5',1,'cv::cudev::operator+(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286f2da548b65f5e52a36f3a0c1b6e72',1,'cv::cudev::operator+(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e7d1a9a90ccd15a67db5330d206d39',1,'cv::cudev::operator+(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdc537c7585647e3c6244b9ff20a0f8c',1,'cv::cudev::operator+(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ad4f702de359a5fc1a9ae0f7e8a675b',1,'cv::cudev::operator+(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac437623c5a924fb1f5ec76555bd9349c',1,'cv::cudev::operator+(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09c0474800254c2fe5df7078b22f0c4',1,'cv::cudev::operator+(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5f3e910fc0bfac66f7b492dfaffa89d',1,'cv::cudev::operator+(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc384f8555e474bf0b42ba3294efbbe',1,'cv::cudev::operator+(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga230f38bc05d616d730d39e284de2a572',1,'cv::cudev::operator+(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ea72be29807fa7a5e3e125bb28ae1da',1,'cv::cudev::operator+(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095e7b638083196b19aa23f0fefb7f8',1,'cv::cudev::operator+(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbbd16fd0445cc803b551cefccee7d84',1,'cv::cudev::operator+(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a507070ee180987e572c027ad63720',1,'cv::cudev::operator+(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c8c57cb603e887926b3ef02d1b1f60f',1,'cv::cudev::operator+(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga751771b8771fc49355177eec0a0c7d11',1,'cv::cudev::operator+(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38a48c26d465ac5004500358a3be3fce',1,'cv::cudev::operator+(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e50479d44fef2f0af1d8bde6e6be5ad',1,'cv::cudev::operator+(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d63e7a7da37c059ee00217e3ab7e4f5',1,'cv::cudev::operator+(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a5a7ffefbe42e9de70da5fa44e0ea4',1,'cv::cudev::operator+(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69524132efa29c8fc980d6064a5c4fe1',1,'cv::cudev::operator+(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84f6e2fa384a11c09c186bf90f942305',1,'cv::cudev::operator+(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9634185808bd5543bffebed158218603',1,'cv::cudev::operator+(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a6f9277eb1d9b4ad95fb976f74be75',1,'cv::cudev::operator+(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1603e29ec853a1114e2fb0815a51ea14',1,'cv::cudev::operator+(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0f4f24948f8a31dd58c7504e95ae',1,'cv::cudev::operator+(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97fa01c350fde8c17cf70e4a665b42b6',1,'cv::cudev::operator+(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fafcdc8062ddf5b9a78cae00c698bec',1,'cv::cudev::operator+(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1fd6fc4c1d59c4d53aa036558028249',1,'cv::cudev::operator+(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd40aac024e1bcaf8023c2e35ced21c1',1,'cv::cudev::operator+(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695049876ddf039f3165e81de036bedf',1,'cv::cudev::operator+(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b80304249a375b80a8ecc267010063c',1,'cv::cudev::operator+(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa15da58a45f9288fb35d6f8804d748c9',1,'cv::cudev::operator+(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2dc62a33db896daaa413d6ea63511cb',1,'cv::cudev::operator+(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d432caa595a9d4e640a86c17dc87b33',1,'cv::cudev::operator+(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecb6ed173735a3e47a133011930bf170',1,'cv::cudev::operator+(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e20dbff7f2045ab3c4be9470646731',1,'cv::cudev::operator+(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89417add04bd126c8f349fc38e0be984',1,'cv::cudev::operator+(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f625b502a1cce9022de0c517a258989',1,'cv::cudev::operator+(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c24ef33bcb0428c76d9000d0c2dda7',1,'cv::cudev::operator+(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b2125e71b80c7fbed85a25428e4c3ce',1,'cv::cudev::operator+(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf25af14c9fafc45956d1531db11144ec',1,'cv::cudev::operator+(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e4c43d9bd3c9baf188b342a11cb6c92',1,'cv::cudev::operator+(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbe87e48c185c1c553f1781c8e51a78b',1,'cv::cudev::operator+(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a9afd18666cabaaff2b5bc1c6953c3d',1,'cv::cudev::operator+(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d6cd004ebf0046d8d05ce58be122e81',1,'cv::cudev::operator+(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf1559bb0b4711ff843e1f8689b0a21b',1,'cv::cudev::operator+(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9722a56f762fd4695dba0a6f581f993a',1,'cv::cudev::operator+(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf855f9f25f4366fe40e26fe92a193707',1,'cv::cudev::operator+(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadedbaa5bcb6aa88fcbbb08af9a056f23',1,'cv::cudev::operator+(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d7795a199307f39f05a7a52b7de164',1,'cv::cudev::operator+(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga491957d2d9dfc406352ab6f9e8c1483e',1,'cv::cudev::operator+(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac82a73e58ad54a045e3d6f90d4f00e91',1,'cv::cudev::operator+(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5509c565962e42b79b574ad682fd5044',1,'cv::cudev::operator+(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27dfa9b51f3a3aef1cbb1e874a1ebb17',1,'cv::cudev::operator+(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd8c880d85625a11bbbe05dea82e01ef',1,'cv::cudev::operator+(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc977b3f2a65f34876a461d9f8518a0f',1,'cv::cudev::operator+(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9be7290ae6342d75ea634d0b164f1ff9',1,'cv::cudev::operator+(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c8f90f6f825fb29b485ffe50390bf9a',1,'cv::cudev::operator+(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0244726591afd293c8228ce596639a63',1,'cv::cudev::operator+(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b851bb2cf578a6c6fe7ef7f02231fa3',1,'cv::cudev::operator+(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac08b7d9bbd26916b5650d4c95cedfdf1',1,'cv::cudev::operator+(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga617aa0c6e7b5bab86edfba469189b518',1,'cv::cudev::operator+(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c8b32a9eb67e145f7e8e6a4f58ee446',1,'cv::cudev::operator+(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa78824f70ed6aff53a468ba69721b940',1,'cv::cudev::operator+(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133f66972b269764ee2ee346366e86f8',1,'cv::cudev::operator+(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf1feb32c0186aa799348a619b15d492',1,'cv::cudev::operator+(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd42be9af8cc02f9ef351bbfead86e9',1,'cv::cudev::operator+(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac578dbae14068cab12ed2474c3d4c26c',1,'cv::cudev::operator+(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaead47ecf6a982cd89d2bd0e641b3b7de',1,'cv::cudev::operator+(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad410367422b6d4613cd9b3267ba698ad',1,'cv::cudev::operator+(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec447276ee554fbeadb63b05ad85816d',1,'cv::cudev::operator+(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac50f4daaf1949b1ef02de731dd4ddf65',1,'cv::cudev::operator+(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bde0cbb5805451c231fdad81908f849',1,'cv::cudev::operator+(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3085b3839365b0059cf1d31f19a63e3b',1,'cv::cudev::operator+(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55869a964cfdd901e7f67148a2e7d39',1,'cv::cudev::operator+(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbe668aec66b824c71e9cedb3e81b476',1,'cv::cudev::operator+(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c65960614e3da3a1c84780c344fff3',1,'cv::cudev::operator+(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f012e7f890a1d981c451c061b18da4f',1,'cv::cudev::operator+(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5bc69c6f65a3267d86c10e9427e50b3',1,'cv::cudev::operator+(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32eb280bd3436219f82bd7749046ce95',1,'cv::cudev::operator+(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa38542588a556bd21f1a3965b23d8d7e',1,'cv::cudev::operator+(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d06cbe3afb88ccc14d64cfa586ebfd',1,'cv::cudev::operator+(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e2e78e19bf1e54a3e764c47de16439',1,'cv::cudev::operator+(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga705b07f251d4e2c6a1d387e47fb0ebbf',1,'cv::cudev::operator+(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ef44a2d91c634e28cb3b493e1f6c9e9',1,'cv::cudev::operator+(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c7ee9b5737344bec6da2ffa4e0131b9',1,'cv::cudev::operator+(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61a7a96d326eace5a635e011cb2c76de',1,'cv::cudev::operator+(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8e25981380ec4e29c96d742e16f4caf',1,'cv::cudev::operator+(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69182858edbcfc754983f725faed9caf',1,'cv::cudev::operator+(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58a0aa4ac62f9368f026cc9cae4ab27c',1,'cv::cudev::operator+(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4932125e3fb3d43e988f20d98c92088a',1,'cv::cudev::operator+(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80481ef157cd534a7917db2c17806e11',1,'cv::cudev::operator+(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1945ac3f9acb340d56b2a123b56e2b6',1,'cv::cudev::operator+(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cda29304020b62ea1023d4c78357da9',1,'cv::cudev::operator+(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3890c98225ce81b7a9563dcadcbaa726',1,'cv::cudev::operator+(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2729c40733ac42bc9d8e8f22515d280b',1,'cv::cudev::operator+(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga815dd0dd7f2c53d35d474093f4f280a5',1,'cv::cudev::operator+(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f87c194094f4b225e01acc41ab4794c',1,'cv::cudev::operator+(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2935ebf4613c634864ae4604a27887ac',1,'cv::cudev::operator+(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cf666905454d84b149ae1f48d67bcc7',1,'cv::cudev::operator+(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedaaa885c3e387fcd8a57556223aa7a6',1,'cv::cudev::operator+(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab897af788ef49fe0a09832df944d61df',1,'cv::cudev::operator+(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b4ee5d82e458102eeab773243ea035',1,'cv::cudev::operator+(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5661c7cb9979d6cc95e98a6b324f3027',1,'cv::cudev::operator+(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga215e0e32a513cc0a9d870aa2af9f8563',1,'cv::cudev::operator+(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66d278c2d4206520854c7bf1ccfe0f71',1,'cv::cudev::operator+(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22d7acef9c458758b9938b5c16ecf1a6',1,'cv::cudev::operator+(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c186b379a335e9c0934a7558d7ab6f',1,'cv::cudev::operator+(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa575be0a6a9b80ba0400783ee96172ff',1,'cv::cudev::operator+(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04e953ca224c70e9a2b72a2b32f2cbfd',1,'cv::cudev::operator+(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e63aa7508890f5fc5fe74de963be45',1,'cv::cudev::operator+(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b64430c28f9c83e524066f22576c72c',1,'cv::cudev::operator+(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2807cdcc4a5d60ad709603abceac15',1,'cv::cudev::operator+(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6843246a6684565e67ed25c20c26b274',1,'cv::cudev::operator+(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0d509dbc5cc5eca3f74d25bf58dc55f',1,'cv::cudev::operator+(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac178c31b30000975ec5f66528b8729cd',1,'cv::cudev::operator+(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd5263d626e5688f4eea2edab7d3181f',1,'cv::cudev::operator+(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101de5c53f41c316a19a38dae5b117fe',1,'cv::cudev::operator+(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf58403ff9e23b6cee2516093cd97591e',1,'cv::cudev::operator+(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa185dbf1eb74efb51f3c5b3df4a9779',1,'cv::cudev::operator+(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1ba272cc5c9a2e39be16e19d70f2b0f',1,'cv::cudev::operator+(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af6b3a5e6fae8011628bcba8f730fe6',1,'cv::cudev::operator+(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bea5e892ad256972784f4f242e238a6',1,'cv::cudev::operator+(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34e88270476eaec6947195ac65632fb3',1,'cv::cudev::operator+(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc25f8350d7b49e877a5056c01b0d3a',1,'cv::cudev::operator+(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49bb3b73cfc2d3814000189184c152e7',1,'cv::cudev::operator+(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b58436ecb19bfa8164de7f990262b3c',1,'cv::cudev::operator+(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2032e800d832a8073d0dc2faef8a2dcd',1,'cv::cudev::operator+(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cef590a05e646cd57f77e6ee0be2d54',1,'cv::cudev::operator+(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb7eb522b0b7eb2799e015cfa8b74f53',1,'cv::cudev::operator+(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2af58cde3e25ca7ac04bcf1f55b52b52',1,'cv::cudev::operator+(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9317db3a8d728e6cfa073f4d57f21451',1,'cv::cudev::operator+(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22fdf93a0c8baf015b0d4b3b2cae8647',1,'cv::cudev::operator+(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b86c6d7c58b0794918765f9c1b839b',1,'cv::cudev::operator+(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eb912d94c68c7c592a8abd305d70aa1',1,'cv::cudev::operator+(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0188cf93b31b6d645c8f34f3992acde',1,'cv::cudev::operator+(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa95c038dfcd6f3375fd02c768ad735',1,'cv::cudev::operator+(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72cbd50d5d37be4e5174a68c21197617',1,'cv::cudev::operator+(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb87110c2951164d19f445969b076e96',1,'cv::cudev::operator+(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3e30731dbc17b3371d8017ccecd7d8b',1,'cv::cudev::operator+(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee5ba2d0674493e83ef9f46c19d01780',1,'cv::cudev::operator+(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab720a95ea55112441355a03963e8cb33',1,'cv::cudev::operator+(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03459898b7324f26de2388149ab4405',1,'cv::cudev::operator+(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c6f1db356d455ca3a7f71e81b43c6cb',1,'cv::cudev::operator+(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b4fd2d02f582f3f5c3071a157733fef',1,'cv::cudev::operator+(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73ac7a1964fb9064b94b7000ae14b06c',1,'cv::cudev::operator+(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c37d85d76f27f899a71677bf2c87965',1,'cv::cudev::operator+(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad67577fc0a303c66c31bb1cf11f072f4',1,'cv::cudev::operator+(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga463d44e45ae112517e69b59e5c05d2a2',1,'cv::cudev::operator+(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d45696a36817a7e03096ccb93efd678',1,'cv::cudev::operator+(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab881ab61562effcbdfb223834615cf9b',1,'cv::cudev::operator+(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845975ac0aa7a6e6ebcc6a0a5ccd1c6d',1,'cv::cudev::operator+(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ba4d696f23852287e920f9e39edbbc',1,'cv::cudev::operator+(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32199ebd017e38ef320461f564645fb1',1,'cv::cudev::operator+(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a277011ea76600e79758badd705b678',1,'cv::cudev::operator+(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab43588987ff4b565dff1496dcd93ceae',1,'cv::cudev::operator+(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4152033d3851f97c38b771e239265f04',1,'cv::cudev::operator+(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d988af531245304baa08913efeb0640',1,'cv::cudev::operator+(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10081f4c12a23d7b318423b00c0db522',1,'cv::cudev::operator+(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247ce351637b9c0b52f4915a7d2c4f6b',1,'cv::cudev::operator+(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a268a36253f07ca021dcebfee47ad10',1,'cv::cudev::operator+(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bbe87b038e1f5206c9d675104f91641',1,'cv::cudev::operator+(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab21b3162568bd7ae01f795a239f30ae5',1,'cv::cudev::operator+(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f3015dbf9a8bfebccee4ff5f8f0a13',1,'cv::cudev::operator+(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15d13e591d5ee6826542214b0b74046d',1,'cv::cudev::operator+(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e4033519a3535d8a458fb00ebee1559',1,'cv::cudev::operator+(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931953ada1dffe875beabe1f8f7bd030',1,'cv::cudev::operator+(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f610a053e45fa3c16c26b8fdac93563',1,'cv::cudev::operator+(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ff42a78160f10c832b89c2a7164e9ed',1,'cv::cudev::operator+(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c92678779773f7e36cbb585aff566f',1,'cv::cudev::operator+(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22ace1eefc87813ef769f102b0b3769d',1,'cv::cudev::operator+(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4814b6e72f311d414e0850c0b06ff2c8',1,'cv::cudev::operator+(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b9b43b4642e35d27d7ac6daaae1cf1a',1,'cv::cudev::operator+(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfe6d281caa0fcb744e38d8bca4c8d10',1,'cv::cudev::operator+(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb868810dbd9f370826a464fbfd6b63a',1,'cv::cudev::operator+(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafca4bacae455e2b15d9120d3495dd896',1,'cv::cudev::operator+(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc478dda6bd01bc954b9c52305187699',1,'cv::cudev::operator+(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf711eec1f4565f53cc5b24ffb4a65913',1,'cv::cudev::operator+(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4a1f5111573c3bd3ecfd696a6de505',1,'cv::cudev::operator+(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c4d7c3df7d674b9ff59c463173a1af5',1,'cv::cudev::operator+(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b48c6860baafe07388ea2d096ea63a8',1,'cv::cudev::operator+(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81619ea66499b085d6230361d755efd1',1,'cv::cudev::operator+(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4abcffbca6e6949ee898f486b7e74862',1,'cv::cudev::operator+(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f85134d8553add116bd4111d710dfe6',1,'cv::cudev::operator+(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a5b0f36ca97b7681786abe433e95225',1,'cv::cudev::operator+(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bca16e176bdf04054bf50edd8434825',1,'cv::cudev::operator+(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadb3c3fbb5bf49638bcaeddbfd16f3df7',1,'operator+(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gacf49831e844a094b21a41a37df2189e8',1,'operator+(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga9d4eb51e74c435420686e52b53d915a0',1,'operator+(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga385a1836312404fd848a8f74b8ad7864',1,'operator+(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0564f5e1dc7986e8b367e5e18d628cf9',1,'operator+(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5751f0f9eea09af7d7be1a7ff9a6419',1,'operator+(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4926bad3815b360be75781d8f789a299',1,'operator+(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487522cfe2377387f941eb27b11052f0',1,'operator+(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5318bd8d2d748d2c2f2e85cfa83f4174',1,'operator+(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a593b2d7e5a664703a3189cfa3e8a2b',1,'operator+(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga401671318958313b03cab9656be10333',1,'operator+(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34588ecb09ba0f5b8bce1932b71ac2dc',1,'operator+(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab32742b4d82dacbf5b03c3caaa21ad6a',1,'operator+(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb808a69e62713677618f7e6aa6bad1c',1,'operator+(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e85ea3a9090037ad78ba58f8d0635d1',1,'operator+(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa545ec34a0a8d0b6b566d40d6b06be4',1,'operator+(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88558d974e34b06012625b059582f84f',1,'operator+(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ef3164d983c6c208fa7eae2d04e4901',1,'operator+(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00e830af93185b0b0d9254abb4a3ba25',1,'operator+(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga360059063d9c94f6895ad04c5538caa2',1,'operator+(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab09d02dd9ae9cba4fff849e8cb4f011b',1,'operator+(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaee9d8126772df36af785513ee3f33a0',1,'operator+(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7809d9f6135f58240496734783a0d8e7',1,'operator+(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa48ac783fc4d8c222edc3a5fee93d08',1,'operator+(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1413eaa25988525f32e8b0c38588aca4',1,'operator+(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31142062b4480b36487e1ceaf5001c60',1,'operator+(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657e5172dce9285cd3450207c231ba91',1,'operator+(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c965673b83d820595742fcba9d84ae6',1,'operator+(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c140fc976d1e3b806105fbc841c5c8b',1,'operator+(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87375c057e8e240da0620c8d30375fae',1,'operator+(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f396374a8c6eaab38c438aa19f61953',1,'operator+(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafadeec24b1b0d32d74f4bf66913a4961',1,'operator+(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4626d73f4a41498ea009b0405b6fc58',1,'operator+(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafec18ef79d72a4abcb395b55fa950ecc',1,'operator+(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd70100577469c4b17877014098c321c',1,'operator+(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga070cddd435b54d39dd9f53202de91e70',1,'operator+(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65c78b19985aebe50cff55cb91091cb5',1,'operator+(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a8be678d5c6d59577d013b1bc0f659a',1,'operator+(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad505ddfe2b0b2efd85712ee4ee151ee',1,'operator+(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa716696f351b72ed62b2eb9298e92431',1,'operator+(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24687bb3a3f43d4cf77051b7f61c5bb5',1,'operator+(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286f2da548b65f5e52a36f3a0c1b6e72',1,'operator+(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e7d1a9a90ccd15a67db5330d206d39',1,'operator+(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdc537c7585647e3c6244b9ff20a0f8c',1,'operator+(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ad4f702de359a5fc1a9ae0f7e8a675b',1,'operator+(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac437623c5a924fb1f5ec76555bd9349c',1,'operator+(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09c0474800254c2fe5df7078b22f0c4',1,'operator+(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5f3e910fc0bfac66f7b492dfaffa89d',1,'operator+(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc384f8555e474bf0b42ba3294efbbe',1,'operator+(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga230f38bc05d616d730d39e284de2a572',1,'operator+(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ea72be29807fa7a5e3e125bb28ae1da',1,'operator+(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095e7b638083196b19aa23f0fefb7f8',1,'operator+(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbbd16fd0445cc803b551cefccee7d84',1,'operator+(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a507070ee180987e572c027ad63720',1,'operator+(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c8c57cb603e887926b3ef02d1b1f60f',1,'operator+(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga751771b8771fc49355177eec0a0c7d11',1,'operator+(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38a48c26d465ac5004500358a3be3fce',1,'operator+(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e50479d44fef2f0af1d8bde6e6be5ad',1,'operator+(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d63e7a7da37c059ee00217e3ab7e4f5',1,'operator+(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a5a7ffefbe42e9de70da5fa44e0ea4',1,'operator+(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69524132efa29c8fc980d6064a5c4fe1',1,'operator+(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84f6e2fa384a11c09c186bf90f942305',1,'operator+(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9634185808bd5543bffebed158218603',1,'operator+(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a6f9277eb1d9b4ad95fb976f74be75',1,'operator+(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1603e29ec853a1114e2fb0815a51ea14',1,'operator+(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0f4f24948f8a31dd58c7504e95ae',1,'operator+(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97fa01c350fde8c17cf70e4a665b42b6',1,'operator+(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fafcdc8062ddf5b9a78cae00c698bec',1,'operator+(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1fd6fc4c1d59c4d53aa036558028249',1,'operator+(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd40aac024e1bcaf8023c2e35ced21c1',1,'operator+(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695049876ddf039f3165e81de036bedf',1,'operator+(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b80304249a375b80a8ecc267010063c',1,'operator+(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa15da58a45f9288fb35d6f8804d748c9',1,'operator+(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2dc62a33db896daaa413d6ea63511cb',1,'operator+(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d432caa595a9d4e640a86c17dc87b33',1,'operator+(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecb6ed173735a3e47a133011930bf170',1,'operator+(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e20dbff7f2045ab3c4be9470646731',1,'operator+(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89417add04bd126c8f349fc38e0be984',1,'operator+(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f625b502a1cce9022de0c517a258989',1,'operator+(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c24ef33bcb0428c76d9000d0c2dda7',1,'operator+(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b2125e71b80c7fbed85a25428e4c3ce',1,'operator+(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf25af14c9fafc45956d1531db11144ec',1,'operator+(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e4c43d9bd3c9baf188b342a11cb6c92',1,'operator+(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbe87e48c185c1c553f1781c8e51a78b',1,'operator+(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a9afd18666cabaaff2b5bc1c6953c3d',1,'operator+(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d6cd004ebf0046d8d05ce58be122e81',1,'operator+(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf1559bb0b4711ff843e1f8689b0a21b',1,'operator+(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9722a56f762fd4695dba0a6f581f993a',1,'operator+(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf855f9f25f4366fe40e26fe92a193707',1,'operator+(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadedbaa5bcb6aa88fcbbb08af9a056f23',1,'operator+(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d7795a199307f39f05a7a52b7de164',1,'operator+(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga491957d2d9dfc406352ab6f9e8c1483e',1,'operator+(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac82a73e58ad54a045e3d6f90d4f00e91',1,'operator+(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5509c565962e42b79b574ad682fd5044',1,'operator+(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27dfa9b51f3a3aef1cbb1e874a1ebb17',1,'operator+(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd8c880d85625a11bbbe05dea82e01ef',1,'operator+(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc977b3f2a65f34876a461d9f8518a0f',1,'operator+(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9be7290ae6342d75ea634d0b164f1ff9',1,'operator+(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c8f90f6f825fb29b485ffe50390bf9a',1,'operator+(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0244726591afd293c8228ce596639a63',1,'operator+(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b851bb2cf578a6c6fe7ef7f02231fa3',1,'operator+(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac08b7d9bbd26916b5650d4c95cedfdf1',1,'operator+(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga617aa0c6e7b5bab86edfba469189b518',1,'operator+(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c8b32a9eb67e145f7e8e6a4f58ee446',1,'operator+(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa78824f70ed6aff53a468ba69721b940',1,'operator+(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133f66972b269764ee2ee346366e86f8',1,'operator+(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf1feb32c0186aa799348a619b15d492',1,'operator+(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd42be9af8cc02f9ef351bbfead86e9',1,'operator+(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac578dbae14068cab12ed2474c3d4c26c',1,'operator+(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaead47ecf6a982cd89d2bd0e641b3b7de',1,'operator+(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad410367422b6d4613cd9b3267ba698ad',1,'operator+(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec447276ee554fbeadb63b05ad85816d',1,'operator+(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac50f4daaf1949b1ef02de731dd4ddf65',1,'operator+(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bde0cbb5805451c231fdad81908f849',1,'operator+(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3085b3839365b0059cf1d31f19a63e3b',1,'operator+(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55869a964cfdd901e7f67148a2e7d39',1,'operator+(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbe668aec66b824c71e9cedb3e81b476',1,'operator+(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c65960614e3da3a1c84780c344fff3',1,'operator+(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f012e7f890a1d981c451c061b18da4f',1,'operator+(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5bc69c6f65a3267d86c10e9427e50b3',1,'operator+(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32eb280bd3436219f82bd7749046ce95',1,'operator+(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa38542588a556bd21f1a3965b23d8d7e',1,'operator+(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d06cbe3afb88ccc14d64cfa586ebfd',1,'operator+(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e2e78e19bf1e54a3e764c47de16439',1,'operator+(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga705b07f251d4e2c6a1d387e47fb0ebbf',1,'operator+(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ef44a2d91c634e28cb3b493e1f6c9e9',1,'operator+(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c7ee9b5737344bec6da2ffa4e0131b9',1,'operator+(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61a7a96d326eace5a635e011cb2c76de',1,'operator+(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8e25981380ec4e29c96d742e16f4caf',1,'operator+(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69182858edbcfc754983f725faed9caf',1,'operator+(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58a0aa4ac62f9368f026cc9cae4ab27c',1,'operator+(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4932125e3fb3d43e988f20d98c92088a',1,'operator+(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80481ef157cd534a7917db2c17806e11',1,'operator+(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1945ac3f9acb340d56b2a123b56e2b6',1,'operator+(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cda29304020b62ea1023d4c78357da9',1,'operator+(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3890c98225ce81b7a9563dcadcbaa726',1,'operator+(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2729c40733ac42bc9d8e8f22515d280b',1,'operator+(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga815dd0dd7f2c53d35d474093f4f280a5',1,'operator+(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f87c194094f4b225e01acc41ab4794c',1,'operator+(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2935ebf4613c634864ae4604a27887ac',1,'operator+(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cf666905454d84b149ae1f48d67bcc7',1,'operator+(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedaaa885c3e387fcd8a57556223aa7a6',1,'operator+(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab897af788ef49fe0a09832df944d61df',1,'operator+(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b4ee5d82e458102eeab773243ea035',1,'operator+(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5661c7cb9979d6cc95e98a6b324f3027',1,'operator+(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga215e0e32a513cc0a9d870aa2af9f8563',1,'operator+(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66d278c2d4206520854c7bf1ccfe0f71',1,'operator+(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22d7acef9c458758b9938b5c16ecf1a6',1,'operator+(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c186b379a335e9c0934a7558d7ab6f',1,'operator+(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa575be0a6a9b80ba0400783ee96172ff',1,'operator+(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04e953ca224c70e9a2b72a2b32f2cbfd',1,'operator+(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e63aa7508890f5fc5fe74de963be45',1,'operator+(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b64430c28f9c83e524066f22576c72c',1,'operator+(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2807cdcc4a5d60ad709603abceac15',1,'operator+(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6843246a6684565e67ed25c20c26b274',1,'operator+(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0d509dbc5cc5eca3f74d25bf58dc55f',1,'operator+(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac178c31b30000975ec5f66528b8729cd',1,'operator+(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd5263d626e5688f4eea2edab7d3181f',1,'operator+(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101de5c53f41c316a19a38dae5b117fe',1,'operator+(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf58403ff9e23b6cee2516093cd97591e',1,'operator+(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa185dbf1eb74efb51f3c5b3df4a9779',1,'operator+(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1ba272cc5c9a2e39be16e19d70f2b0f',1,'operator+(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af6b3a5e6fae8011628bcba8f730fe6',1,'operator+(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bea5e892ad256972784f4f242e238a6',1,'operator+(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34e88270476eaec6947195ac65632fb3',1,'operator+(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc25f8350d7b49e877a5056c01b0d3a',1,'operator+(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49bb3b73cfc2d3814000189184c152e7',1,'operator+(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b58436ecb19bfa8164de7f990262b3c',1,'operator+(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2032e800d832a8073d0dc2faef8a2dcd',1,'operator+(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cef590a05e646cd57f77e6ee0be2d54',1,'operator+(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb7eb522b0b7eb2799e015cfa8b74f53',1,'operator+(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2af58cde3e25ca7ac04bcf1f55b52b52',1,'operator+(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9317db3a8d728e6cfa073f4d57f21451',1,'operator+(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22fdf93a0c8baf015b0d4b3b2cae8647',1,'operator+(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b86c6d7c58b0794918765f9c1b839b',1,'operator+(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eb912d94c68c7c592a8abd305d70aa1',1,'operator+(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0188cf93b31b6d645c8f34f3992acde',1,'operator+(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa95c038dfcd6f3375fd02c768ad735',1,'operator+(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72cbd50d5d37be4e5174a68c21197617',1,'operator+(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb87110c2951164d19f445969b076e96',1,'operator+(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3e30731dbc17b3371d8017ccecd7d8b',1,'operator+(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee5ba2d0674493e83ef9f46c19d01780',1,'operator+(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab720a95ea55112441355a03963e8cb33',1,'operator+(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03459898b7324f26de2388149ab4405',1,'operator+(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c6f1db356d455ca3a7f71e81b43c6cb',1,'operator+(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b4fd2d02f582f3f5c3071a157733fef',1,'operator+(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73ac7a1964fb9064b94b7000ae14b06c',1,'operator+(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c37d85d76f27f899a71677bf2c87965',1,'operator+(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad67577fc0a303c66c31bb1cf11f072f4',1,'operator+(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga463d44e45ae112517e69b59e5c05d2a2',1,'operator+(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d45696a36817a7e03096ccb93efd678',1,'operator+(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab881ab61562effcbdfb223834615cf9b',1,'operator+(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845975ac0aa7a6e6ebcc6a0a5ccd1c6d',1,'operator+(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ba4d696f23852287e920f9e39edbbc',1,'operator+(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32199ebd017e38ef320461f564645fb1',1,'operator+(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a277011ea76600e79758badd705b678',1,'operator+(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab43588987ff4b565dff1496dcd93ceae',1,'operator+(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4152033d3851f97c38b771e239265f04',1,'operator+(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d988af531245304baa08913efeb0640',1,'operator+(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10081f4c12a23d7b318423b00c0db522',1,'operator+(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247ce351637b9c0b52f4915a7d2c4f6b',1,'operator+(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a268a36253f07ca021dcebfee47ad10',1,'operator+(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bbe87b038e1f5206c9d675104f91641',1,'operator+(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab21b3162568bd7ae01f795a239f30ae5',1,'operator+(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f3015dbf9a8bfebccee4ff5f8f0a13',1,'operator+(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15d13e591d5ee6826542214b0b74046d',1,'operator+(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e4033519a3535d8a458fb00ebee1559',1,'operator+(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931953ada1dffe875beabe1f8f7bd030',1,'operator+(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f610a053e45fa3c16c26b8fdac93563',1,'operator+(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ff42a78160f10c832b89c2a7164e9ed',1,'operator+(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c92678779773f7e36cbb585aff566f',1,'operator+(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22ace1eefc87813ef769f102b0b3769d',1,'operator+(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4814b6e72f311d414e0850c0b06ff2c8',1,'operator+(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b9b43b4642e35d27d7ac6daaae1cf1a',1,'operator+(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfe6d281caa0fcb744e38d8bca4c8d10',1,'operator+(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb868810dbd9f370826a464fbfd6b63a',1,'operator+(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafca4bacae455e2b15d9120d3495dd896',1,'operator+(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc478dda6bd01bc954b9c52305187699',1,'operator+(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf711eec1f4565f53cc5b24ffb4a65913',1,'operator+(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4a1f5111573c3bd3ecfd696a6de505',1,'operator+(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c4d7c3df7d674b9ff59c463173a1af5',1,'operator+(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b48c6860baafe07388ea2d096ea63a8',1,'operator+(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81619ea66499b085d6230361d755efd1',1,'operator+(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4abcffbca6e6949ee898f486b7e74862',1,'operator+(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f85134d8553add116bd4111d710dfe6',1,'operator+(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a5b0f36ca97b7681786abe433e95225',1,'operator+(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bca16e176bdf04054bf50edd8434825',1,'operator+(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a7e943cfd42382fe2fcba3fd5b4fc1476',1,'__gnu_cxx::operator+(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ab2b89b39ac900719a3a14e634ec860a5',1,'__gnu_cxx::operator+(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#acc9338b2661112c05017dbdeb21df9c7',1,'__gnu_cxx::operator+(_CharT __lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ab0f3593c273db1a2619a43db92c66efe',1,'__gnu_cxx::operator+(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a72c2b3659c31815c11e1d6b1a1d7e924',1,'__gnu_cxx::operator+(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, _CharT __rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gafa26cb16064a2b5197bfa440c98bdd95',1,'std::operator+(const complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a31fffa82cc0872d928c7d11371c34c49',1,'std::operator+(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae220860a64ea80fb9522daf38053aa8f',1,'std::operator+(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a952b727c802635e947a9a6b64f2f3ed1',1,'std::operator+(_CharT __lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7ba297cc435f21d90383baeebae8652c',1,'std::operator+(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa8298429823127738ccdf0b66e07249e',1,'std::operator+(const basic_string< _CharT, _Traits, _Alloc > &__lhs, _CharT __rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gada3d19f6d35799895239d9d8da91b874',1,'std::operator+(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaaa550f4048e573f92e2fbfae0ce8eab',1,'std::operator+(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga0bc80c123fa74e604e7d598b7e2b3a50',1,'std::operator+(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gafa26cb16064a2b5197bfa440c98bdd95',1,'operator+(const complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gada3d19f6d35799895239d9d8da91b874',1,'operator+(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaaa550f4048e573f92e2fbfae0ce8eab',1,'operator+(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga0bc80c123fa74e604e7d598b7e2b3a50',1,'operator+(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga33a3a90827549220500c99f95b095816',1,'operator+() const(Global Namespace)']]], - ['operator_2b_2b_109',['operator++',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a6a06cf1a5b94057476a925f3f758c490',1,'cv::FileNodeIterator::operator++()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a4daed1197209314a7a9bada1cb21af53',1,'cv::FileNodeIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a70052c25251e3387d8ab80d86febef95',1,'cv::LineIterator::operator++()'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a79c1edcfb30865c5abec03e48f91bcdc',1,'cv::LineIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a7f30a14ed656e99d0297fb028316d23a',1,'cv::MatConstIterator::operator++()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a9ee1e96236b15dcadf6d383db272b49e',1,'cv::MatConstIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ae079204d24a71cbadf489e2a7be4fd17',1,'cv::MatConstIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a04b79539dc9788dd44ffe41dc737f008',1,'cv::MatConstIterator_::operator++(int)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a164083b962b0b7ac8df36e9a90a4fab1',1,'cv::MatIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a3046b334bfa46d6cb19596fe552b4eb9',1,'cv::MatIterator_::operator++(int)'],['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a3e686d47da475b75c9b8ec11723bb2f3',1,'cv::NAryMatIterator::operator++()'],['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a260701f031521ebeac69bcc35c02a0d9',1,'cv::NAryMatIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ad72bcf02305bcfcd92d4006621225fbd',1,'cv::SparseMatConstIterator::operator++()'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ac18bf0568c460ed4a3c652348ef3f6a8',1,'cv::SparseMatConstIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a6c4e03aa55423633e9b7ba5df92530f0',1,'cv::SparseMatConstIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a2a1bbc3e0dcbdd3a08a89397bfad38ee',1,'cv::SparseMatConstIterator_::operator++(int)'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a8685211cc25d171aa9687847a76406c0',1,'cv::SparseMatIterator::operator++()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#aa89c17982bf2f3d1057d2bc09d36462b',1,'cv::SparseMatIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a5dd3f1223ff101fd63a670102e1a805c',1,'cv::SparseMatIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#af5357404aa31635fe16fb7900c24e990',1,'cv::SparseMatIterator_::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#af083e59c576b9e4f483df16b7411c10f',1,'__gnu_debug::_Safe_iterator::operator++() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a0e18ec08b2e93621558f7ba5ced2dda6',1,'__gnu_debug::_Safe_iterator::operator++(int) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#ae86d3f9ac2f797a9231fb441c3a85f04',1,'__gnu_debug::_Safe_local_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a970d20722ad94a43afaa2e4db289f85e',1,'__gnu_debug::_Safe_local_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#ab5ee82c060324ccc10d02831a5270a7c',1,'__gnu_parallel::_GuardedIterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#af083e59c576b9e4f483df16b7411c10f',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator++() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a0e18ec08b2e93621558f7ba5ced2dda6',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator++(int) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#af083e59c576b9e4f483df16b7411c10f',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator++() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a0e18ec08b2e93621558f7ba5ced2dda6',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator++(int) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#aabeb7276d4ce2366c5bb6c9a9f213546',1,'const_iterator_::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#abb2e9ec96985b4c74418481ebb6e47e1',1,'const_iterator_::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#ae3ce4e8d7eab45011fa177454aecf378',1,'iterator_::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#ad5a05ab49fce8dd1c5eb8b807f0d84f5',1,'iterator_::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#a86e4cf04673011aa38c843b3eb44e2f8',1,'std::back_insert_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#ad9e4589271dccb8b64df10af255d4076',1,'std::back_insert_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#aac63c27293526bf0b0c4d4a2472ba785',1,'std::front_insert_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#a0bb8e39402c65287d891388eaea27c8b',1,'std::front_insert_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a66d30004d7402c9067fa8faadd7b8861',1,'std::insert_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a1d81a713bb24ef57aba0ce6dba2a84f0',1,'std::insert_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a4c45d7bfc4e2a3594fb8918017b4ac3a',1,'std::istreambuf_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#adb987d5d42a928df600f5068d8a9e1dc',1,'std::istreambuf_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ad925d614752b837a7147d44d322a6aad',1,'std::ostreambuf_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#a0e9d282823cd7811717ad6bd890f8626',1,'std::ostreambuf_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#af1cd40b1c657b09254c830a6db8bd207',1,'std::regex_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a5cc20a645b74551c5130c8740fe96d9e',1,'std::regex_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a7d7768b8573112a25b0f2a567fd2b72c',1,'std::regex_token_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a699a85d3f9aed40a35d338596b8b2f9e',1,'std::regex_token_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a785ca20b14ac95ee033695423ecf1d53',1,'std::reverse_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a27c37221dec91844c7a72cb9dc28441d',1,'std::reverse_iterator::operator++(int)']]], - ['operator_2b_3d_110',['operator+=',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a77b08ee6b326b9d83ed01de4b30930d2',1,'cv::FileNodeIterator::operator+=()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a52fbb4c870f2c7678c29d892cf8f8307',1,'cv::MatConstIterator::operator+=()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ae423bce6d88387faeb59c63a818b7627',1,'cv::MatConstIterator_::operator+=()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a3bc7e3002fdda7346c15a455352673b2',1,'cv::MatIterator_::operator+=()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'cv::Matx::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'cv::Matx::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< _Tp, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< _Tp, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 1, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 1, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 2 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 2 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float_type, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float_type, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c429977f1b260829de0a009f8105029',1,'cv::softdouble::operator+=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga478a5a673e3131fbfd1c7a357f878023',1,'cv::softfloat::operator+=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'cv::Vec::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'cv::Vec::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< _Tp, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< _Tp, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a4b8715fc8f6a53505b98b9b19b512453',1,'__gnu_cxx::__versa_string::operator+=(const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a79d20017299bbfc786b2d5540e5af61d',1,'__gnu_cxx::__versa_string::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac14c7143cc1a4ed1ad31593b4a8da43b',1,'__gnu_cxx::__versa_string::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a1a409030e39ba995df18fefc38525c2a',1,'__gnu_cxx::__versa_string::operator+=(std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'__gnu_debug::basic_string::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< _CharT >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< _CharT >::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< _CharT >::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< _CharT >::operator+=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(_Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< char >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< char >::operator+=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< char >::operator+=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< char >::operator+=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< value_type >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< value_type >::operator+=(const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< value_type >::operator+=(value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< value_type >::operator+=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'std::basic_string::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'std::basic_string::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'std::basic_string::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'std::basic_string::operator+=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a1994cceaeac8896749a47d2d61e6754f',1,'std::complex::operator+=(const _Tp &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gabf4797890e21e8f0f05b3a73aa215395',1,'std::complex::operator+=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a82884338bf22e5b2e47088240ee3603c',1,'std::fpos::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadaedde83c0c3dc087cd28fede7547179',1,'std::gslice_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaeb7b9d2b39d2312c117a50769114e26c',1,'std::indirect_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga3cd7a0e7c02e60936993f2f8d85d7e14',1,'std::mask_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a2060fd42f847719055e4b416650824ea',1,'std::reverse_iterator::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabffb22fe7508d7fb6b06e4ca76440fc0',1,'std::slice_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga75cc5c668aaade5ccc50b199d789e191',1,'std::valarray::operator+=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8b82cbb5b9eafa8c1fc86ae8678e1f36',1,'std::valarray::operator+=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga75cc5c668aaade5ccc50b199d789e191',1,'valarray< size_t >::operator+=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8b82cbb5b9eafa8c1fc86ae8678e1f36',1,'valarray< size_t >::operator+=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a9cc9fdb4d0d6eb80a45107b86aacbfed',1,'Eigen::ArrayBase::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a9cc9fdb4d0d6eb80a45107b86aacbfed',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a983cc3be0bbe11b3d041a415b76ce010',1,'Eigen::MatrixBase::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a983cc3be0bbe11b3d041a415b76ce010',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a983cc3be0bbe11b3d041a415b76ce010',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a1d2edf8ab80733b8b2620d8c2a3100d3',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'Eigen::VectorwiseOp::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Derived, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Derived, Vertical >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator+=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a40226d9c84fcb9cb948ae0c27b842c57.html#a40226d9c84fcb9cb948ae0c27b842c57',1,'nlohmann::basic_json::operator+=(basic_json &&val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_af643a4baa91f484b11af0e4437183115.html#af643a4baa91f484b11af0e4437183115',1,'nlohmann::basic_json::operator+=(const basic_json &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ae300819781bce2193369609457f70f30.html#ae300819781bce2193369609457f70f30',1,'nlohmann::basic_json::operator+=(const typename object_t::value_type &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac48302a8b4f8c2a6e30c2a7bff6abc49.html#ac48302a8b4f8c2a6e30c2a7bff6abc49',1,'nlohmann::basic_json::operator+=(initializer_list_t init)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1decb593e539029ba11c6fcc72c969cd',1,'cv::operator+=()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ab8d1fddfb94e88c939838e006e23e295',1,'cv::gapi::own::operator+=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga478a5a673e3131fbfd1c7a357f878023',1,'operator+=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c429977f1b260829de0a009f8105029',1,'operator+=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1decb593e539029ba11c6fcc72c969cd',1,'operator+=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gabf4797890e21e8f0f05b3a73aa215395',1,'operator+=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadaedde83c0c3dc087cd28fede7547179',1,'operator+=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga75cc5c668aaade5ccc50b199d789e191',1,'operator+=(const _Tp &)(Global Namespace)']]], - ['operator_2c_111',['operator,',['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html#a769e50401811af082c9e7fe51b7f5e7c',1,'cv::MatCommaInitializer_::operator,()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a76d12259ac3602278c8082f5fdbc9cec',1,'cv::MatxCommaInitializer::operator,()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a76d12259ac3602278c8082f5fdbc9cec',1,'MatxCommaInitializer< _Tp, m, 1 >::operator,()'],['https://docs.opencv.org/4.2.0/d1/d3e/classcv_1_1VecCommaInitializer.html#ad458955e9c77d81d8078d28e3444dcdf',1,'cv::VecCommaInitializer::operator,()']]], - ['operator_2d_112',['operator-',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a4ec58573be20ff741b7f4d21bc223635',1,'cv::FileNodeIterator::operator-(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a4ec58573be20ff741b7f4d21bc223635',1,'cv::FileNodeIterator::operator-(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae07cd7b4ce3474dbdb1a264e2f6e7b0d',1,'cv::MatExpr::operator-(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad424f126a496afadafb4b6c67a1ce174',1,'cv::MatExpr::operator-(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6ed1d63630a0498bae02e4a71e757342',1,'cv::MatExpr::operator-(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a268e1ccaa369123adf2215756e3fae6a',1,'cv::MatExpr::operator-(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad7a022ce69ea48d8d9110cb79ab27b6a',1,'cv::MatExpr::operator-(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab851dfc040860bcf008d19e4a5926b83',1,'cv::MatExpr::operator-(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0d1940f6e797fb5f8092db30db875bdf',1,'cv::MatExpr::operator-(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a881069f5bff2833f6319cf2e7769fdbe',1,'cv::MatExpr::operator-(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaacefdef37dffe5d5214939666fce32f',1,'cv::MatExpr::operator-(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a3e8db9cfa032043f31d40211508653b1',1,'cv::MatExpr::operator-(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a22ebbe4ce388179e64afe917fa369003',1,'cv::MatExpr::operator-(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a09f773558b48e56dfa061179599e11d0',1,'cv::MatExpr::operator-(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae07cd7b4ce3474dbdb1a264e2f6e7b0d',1,'cv::MatExpr::operator-(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad424f126a496afadafb4b6c67a1ce174',1,'cv::MatExpr::operator-(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6ed1d63630a0498bae02e4a71e757342',1,'cv::MatExpr::operator-(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a268e1ccaa369123adf2215756e3fae6a',1,'cv::MatExpr::operator-(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad7a022ce69ea48d8d9110cb79ab27b6a',1,'cv::MatExpr::operator-(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab851dfc040860bcf008d19e4a5926b83',1,'cv::MatExpr::operator-(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0d1940f6e797fb5f8092db30db875bdf',1,'cv::MatExpr::operator-(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a881069f5bff2833f6319cf2e7769fdbe',1,'cv::MatExpr::operator-(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaacefdef37dffe5d5214939666fce32f',1,'cv::MatExpr::operator-(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a3e8db9cfa032043f31d40211508653b1',1,'cv::MatExpr::operator-(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a22ebbe4ce388179e64afe917fa369003',1,'cv::MatExpr::operator-(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a09f773558b48e56dfa061179599e11d0',1,'cv::MatExpr::operator-(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf6a12deaeedcf12e67dc695caff1068',1,'cv::softdouble::operator-(const softdouble &) const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga8150a63cd7bd61db576f3d89082e8b5d',1,'cv::softdouble::operator-() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga00fec559cf58adaedb43c5092df36b84',1,'cv::softfloat::operator-(const softfloat &) const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6d151a3faa03d866700dd46f0ad04a',1,'cv::softfloat::operator-() const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#af2e0577cdf823db2436ffc2c3e5bf5d5',1,'std::fpos::operator-(streamoff __off) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a9cb8084ee1bb8395c4a5e7a937092425',1,'std::fpos::operator-(const fpos &__other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a3942515868778c8f04f5b34fd78d1fce',1,'std::reverse_iterator::operator-()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga028b49a6d0cf1f6afa48149603d953b2',1,'std::valarray::operator-()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga028b49a6d0cf1f6afa48149603d953b2',1,'valarray< size_t >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'Eigen::VectorwiseOp::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Derived, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Derived, Vertical >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator-()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga657904e675f20f6b84d7821cf1b02576',1,'cv::operator-()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5c17b1b5b5fe0b3b4e8e5bd32cbf72b',1,'cv::cudev::operator-(const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8218dac34f71c38487a697ea52557259',1,'cv::cudev::operator-(const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga369f1d0d8d3803abcc6e10bf145d4edd',1,'cv::cudev::operator-(const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cccd86250a11d8e232198edf4251f14',1,'cv::cudev::operator-(const Expr< Body > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafcebc509ca2a96c5b80ab1b96926b5c',1,'cv::cudev::operator-(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32e53e6cd3aa0aec01a90c11008c5a',1,'cv::cudev::operator-(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa812557e00bb932af910630701a2e6d5',1,'cv::cudev::operator-(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga212b4e512e56d38893b3d94109f19e5a',1,'cv::cudev::operator-(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga923d4bc9a45182d9ff86558f8c3b3e1a',1,'cv::cudev::operator-(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf43079f133408f0dd329fa6f1d316f34',1,'cv::cudev::operator-(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5400e7e698ff6fb2a8e8eb929b71e818',1,'cv::cudev::operator-(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07f833d814ae15aa1f7f06fc72285d71',1,'cv::cudev::operator-(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630122d5ecd56ab75dc7a740237d4277',1,'cv::cudev::operator-(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga589105db257ea2341d3edecdbd69e6cf',1,'cv::cudev::operator-(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c02a04ef1608ad485d445c8e43753b8',1,'cv::cudev::operator-(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbd34fbbcf43515301431c8978721c7a',1,'cv::cudev::operator-(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29b58bdfa78ef5c4d4beac53f7c79c35',1,'cv::cudev::operator-(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae523601438b231456102587a02d29ce0',1,'cv::cudev::operator-(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21579d3d75241e52a788ecda484e20d7',1,'cv::cudev::operator-(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae12acf38186bf6dc6895da587665d36c',1,'cv::cudev::operator-(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9befc50cf1641402af105f9b4ce54707',1,'cv::cudev::operator-(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad871c5ff9bf246716e00f7215515a672',1,'cv::cudev::operator-(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ae31a4395b49fa3b233e0c4ee9f78a1',1,'cv::cudev::operator-(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12f0079672bd7bd0b168ce527cb706b',1,'cv::cudev::operator-(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7852adc318a540c056ea73b49ae8286',1,'cv::cudev::operator-(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae414e560eefa2f108503e79e0a92ce79',1,'cv::cudev::operator-(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c78976f9105914f1896abb0b2ab712',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdaf3a734933d300a18e8e1573041e6a',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga595015df8ac886ee6161c8574c07b0bb',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f02e96ae1741da62734d90363e15b',1,'cv::cudev::operator-(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c2ec4b300add3f39cd2c2005fc9b03b',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga671d1eab95a685d83fb46a3caedaa0e4',1,'cv::cudev::operator-(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29088c5390150a10bd5900f805cf9562',1,'cv::cudev::operator-(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17c6cb1c28feab2d8e488026a90f789d',1,'cv::cudev::operator-(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c2b847a8648af7bb1bf5696a5593e1',1,'cv::cudev::operator-(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f2cad4b2513975e900f994e6ed677d6',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657470335930553724a92428b1eb9014',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa406a939d82354cec9279667daa1ca94',1,'cv::cudev::operator-(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b895e1f04d72d46b19f80936c9c0704',1,'cv::cudev::operator-(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49370160c90b69f0c6e98c898b527368',1,'cv::cudev::operator-(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f5ba88d0b852d2f86afc29e06f1e8a',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97c585e4f802affa218b50922504b4d7',1,'cv::cudev::operator-(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b8b588d37850f2a9d96602a6a5f7d67',1,'cv::cudev::operator-(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga222ce3784f3fc6433767ce8cdaa827f7',1,'cv::cudev::operator-(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2828d795db4524ad86acf6438336fa',1,'cv::cudev::operator-(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2684b612027b487618841db6c1850313',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7d0852b020342bc37b7e507a587905a',1,'cv::cudev::operator-(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9529413b121c4e0c8ee22482a4fab970',1,'cv::cudev::operator-(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5bf61216767dfa9c63290c776fc9dc30',1,'cv::cudev::operator-(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafffe9e12abf7a2013c656198bbfe4019',1,'cv::cudev::operator-(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f600b61f1a94b779ce862a1b2ddc83e',1,'cv::cudev::operator-(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3492f3658fe0c7b45d288f0700124307',1,'cv::cudev::operator-(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0ec17613882c822c1684d5e67aa3ff0',1,'cv::cudev::operator-(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01f9a0cf5655a5f3c4c2e78bde998754',1,'cv::cudev::operator-(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c66bc85731db1174c2eae7646fe8ae',1,'cv::cudev::operator-(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd83b96a13731954f8723e2275e3765',1,'cv::cudev::operator-(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157fca7e19a61dbf087d7654594d4e23',1,'cv::cudev::operator-(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55f1af68b4a753b3a6a3e078d91f1696',1,'cv::cudev::operator-(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf4e04da6c7b24130e4cc8e776a5339a',1,'cv::cudev::operator-(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73809cf57d17ff44a52c02c3b29ecfba',1,'cv::cudev::operator-(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6d871842daa1c70ea4caef8a76670ab',1,'cv::cudev::operator-(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3923c285bfc32ef157d97af42b4dbaa',1,'cv::cudev::operator-(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3091968102f4293b8a37fa22c26fde15',1,'cv::cudev::operator-(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga105d05b599ef729df2112db1626078c9',1,'cv::cudev::operator-(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fc141b8ac2f6e3aeba0e32424591d9',1,'cv::cudev::operator-(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c28d9ff3a737dfe37508d1608d4488',1,'cv::cudev::operator-(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace86d625860816056a815a5ac249841f',1,'cv::cudev::operator-(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c83494077d790efb9cce651ef5c8fb3',1,'cv::cudev::operator-(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fcb4deeb33df8bb7fabc3afdc922947',1,'cv::cudev::operator-(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d0e94e2a3ddb20e082a36b760b374c',1,'cv::cudev::operator-(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf528d8dbd1cb9132a7d8acc3f11b0a89',1,'cv::cudev::operator-(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd1c46a4dceccd18eff03077f8e8da83',1,'cv::cudev::operator-(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26feff449ac4dab327561cc7b98ae303',1,'cv::cudev::operator-(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f0d316266abadce36d9f95350939051',1,'cv::cudev::operator-(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a790596a24ef36db89348e75d2858c',1,'cv::cudev::operator-(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cebc4fe6b6f94f836752ced678af6d6',1,'cv::cudev::operator-(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7912128120aa37fc63d046a614da79',1,'cv::cudev::operator-(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31fa210affd71e287fb5e9b483d8b4b7',1,'cv::cudev::operator-(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39a6f71ae25763350c835bab9dde6025',1,'cv::cudev::operator-(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c17045262474d8006617bf00a10ada',1,'cv::cudev::operator-(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3af755936e984d2d83fe6b1f520d014',1,'cv::cudev::operator-(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff766239f9095c4845abc49acf0e2dd0',1,'cv::cudev::operator-(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga750fd24726debf7081fb1118125a6775',1,'cv::cudev::operator-(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae62193899bb9cc343fa962b4b521e36c',1,'cv::cudev::operator-(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166ed0bcb9dd638829729f92695b12d0',1,'cv::cudev::operator-(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80d8077257094293bb466dab861ac473',1,'cv::cudev::operator-(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772e599865fe047c41f93d58af5c36be',1,'cv::cudev::operator-(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d7fa5317dd05a15f21aa3be368d6c79',1,'cv::cudev::operator-(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafecaf20edf9038a419b4963a649f1362',1,'cv::cudev::operator-(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a7b9dbe190b22a08f72e3f9334e3171',1,'cv::cudev::operator-(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60818b7e8929ee3491aad14dc0bbf7e7',1,'cv::cudev::operator-(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55574f511139402e4cd6820b2e3edeba',1,'cv::cudev::operator-(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9d8281a359296fae7b6ec188101ed8e',1,'cv::cudev::operator-(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7dad42ade73d46813a094b64808c6b8',1,'cv::cudev::operator-(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d789399fa52f9690e6e01fe8d653bc9',1,'cv::cudev::operator-(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24bad9cc2b3b3ac10c819d8fd2ae54e',1,'cv::cudev::operator-(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga064176b3aa847d4e254c1ec1db3f8324',1,'cv::cudev::operator-(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb5d9702bcfe0a2527b510cc84938a4',1,'cv::cudev::operator-(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga459d5db54e31c46b4c5982f98e42fa77',1,'cv::cudev::operator-(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb64bc3f5c6ee79fc1869e51e0e20ea',1,'cv::cudev::operator-(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab72d0df44e48d58d0a83680bcc64c0cd',1,'cv::cudev::operator-(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f14ce38edfb19ba6890f42c9e4bc1c7',1,'cv::cudev::operator-(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ca19596afc498b95a6a7b19375e2776',1,'cv::cudev::operator-(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga830cd97a436668d9feeb2ff08daead24',1,'cv::cudev::operator-(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0447438f3f039aaf24fe21d502153a6c',1,'cv::cudev::operator-(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac95b6a94f1155b246a18f3b845e3cfa7',1,'cv::cudev::operator-(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabecf086f97f0c60573f81155ce6df359',1,'cv::cudev::operator-(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa1778a2f54eb6eafc3a395173fac5b',1,'cv::cudev::operator-(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c69722cf7d46b2ca923926d0a9e7c29',1,'cv::cudev::operator-(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301f25e5157f16b4a044760a1ba51957',1,'cv::cudev::operator-(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga234301df3e003ce08fa1154a6919c3e6',1,'cv::cudev::operator-(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga529a4056534c5e47aa59d256ad69795b',1,'cv::cudev::operator-(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe950dd17a8fa089fe286dc7513ed18b',1,'cv::cudev::operator-(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51346e7356a9c330b5874b3e3e8fdf7a',1,'cv::cudev::operator-(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga087dd0f490602b7f5212a8221cc4c631',1,'cv::cudev::operator-(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa922d047700892efb47a39e2b66e2df7',1,'cv::cudev::operator-(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga030665610f8a68470affbb8fc223480a',1,'cv::cudev::operator-(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9334f4344c1d1203f4e78bad75c7f7ac',1,'cv::cudev::operator-(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c175694697819d86c134405fef567d',1,'cv::cudev::operator-(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c871fd39d365299a7087e48c132e66',1,'cv::cudev::operator-(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35c6854bb46e9164eec0218f869a9b9',1,'cv::cudev::operator-(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97621dfd01d12393ecd93025efb3565f',1,'cv::cudev::operator-(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb1c3da793075b09989fc44ae3f1b9ed',1,'cv::cudev::operator-(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f6f8843f95be97da2d9dd97203a57a7',1,'cv::cudev::operator-(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4b21b2c12c7e804eff3159893bf0da',1,'cv::cudev::operator-(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f8acd15bb673d2ddb88d3fc032f7f46',1,'cv::cudev::operator-(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b1a551cfaf5a99c6fe30782af1dee38',1,'cv::cudev::operator-(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8718012438f8242708e0e7c59e30c0f3',1,'cv::cudev::operator-(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b256b2cc48a9181623a38977e3bac00',1,'cv::cudev::operator-(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58ed6ef928b50877a894f409e8464ac2',1,'cv::cudev::operator-(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77dd6b885a2b9b9b4c44d74be2dbfd74',1,'cv::cudev::operator-(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga599164264373b33e0a535211c0fdccb5',1,'cv::cudev::operator-(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99636b5731e60af2c22851c30f4e1cc2',1,'cv::cudev::operator-(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f068655bf1a117d63ee8d12c9123bc',1,'cv::cudev::operator-(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68155cb7567a70e34854e308bad38bf0',1,'cv::cudev::operator-(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6789124b74d1f4bd32bcbbf0501d6bd',1,'cv::cudev::operator-(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c14a811c0156b0a39c727300af59a3d',1,'cv::cudev::operator-(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628b15bea2200f623235e780644b4738',1,'cv::cudev::operator-(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaed8862546424053275a74eb182123b1',1,'cv::cudev::operator-(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf917f33a395906b4ee4b0d09d3abb4fa',1,'cv::cudev::operator-(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c898d588a40dd071eec1f8c2c74b39f',1,'cv::cudev::operator-(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd0d6d85ac669a3f90307e30aa3cbe00',1,'cv::cudev::operator-(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e5740217efa8fe0abf0abcc760328d',1,'cv::cudev::operator-(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9dd88cc2cbce6d9e4778d60fc7921f7',1,'cv::cudev::operator-(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b9334faac50e773d70fc8dfd0b5ecbe',1,'cv::cudev::operator-(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e525a4e0063c46db0f94eeb30818210',1,'cv::cudev::operator-(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81998f25744b975fc9ad36d109ac830b',1,'cv::cudev::operator-(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd199a5f6d3af032060b2c2d22651ba0',1,'cv::cudev::operator-(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587458f4a3b6baaae54d1bf38c608fdd',1,'cv::cudev::operator-(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c43181792568fdac96ab1f34606f45',1,'cv::cudev::operator-(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad30d5dabcda24d862172a45f57790b0d',1,'cv::cudev::operator-(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71cc98fe99d705fe3f356355a5972c54',1,'cv::cudev::operator-(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae1659d27c0d33e75d72445deaf55930',1,'cv::cudev::operator-(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98feed4df5a73a8ddd6d51b8321af344',1,'cv::cudev::operator-(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b4b59a36beb43c49f01fb86f1bc890',1,'cv::cudev::operator-(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0775017854d4e2b772d672168bd9a5c',1,'cv::cudev::operator-(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b1fa561df0ed7972108d66f89c5c496',1,'cv::cudev::operator-(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf9102f7c51e3a2d88b9073206820a55',1,'cv::cudev::operator-(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2316196b4a8bd1c46e519dd2fc4c3851',1,'cv::cudev::operator-(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3075a67dd4ae9b7543c5e4c897f5ff45',1,'cv::cudev::operator-(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9ba6b5d0f5f1a8ed6d93e4f0ab5e173',1,'cv::cudev::operator-(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedcf75a12dd00e1c503c9106e44a3e98',1,'cv::cudev::operator-(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01b9153cf9b4f0369155cb594e2d1349',1,'cv::cudev::operator-(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ff1bf6c7c124e0c8bd913479790866a',1,'cv::cudev::operator-(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabed2cc5868115ee18468aa3cebb3be19',1,'cv::cudev::operator-(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e312d4b86154b204240572d9e86effd',1,'cv::cudev::operator-(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0418e4172197c9fa9dcd41c9fb3b20f9',1,'cv::cudev::operator-(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b532e3190010cf8358b124e3dde328',1,'cv::cudev::operator-(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195ae36c11666e48a9947af768d97b44',1,'cv::cudev::operator-(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b120b8e056fc331b8069bf1a9ed6fff',1,'cv::cudev::operator-(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8362b5b231be23340c5fb8b99cbb375e',1,'cv::cudev::operator-(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga082c28863107b352ac51038a23d06300',1,'cv::cudev::operator-(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga915ab09a582414ca39929cdb812f758a',1,'cv::cudev::operator-(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ea8ddbac826668fdc04ab8f99e66d9',1,'cv::cudev::operator-(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc941af3597d7061a0661159a5469162',1,'cv::cudev::operator-(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94ea2c59d0991a2fc0298c7f5a24e50',1,'cv::cudev::operator-(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2270da17955731575fe008dc96c80bda',1,'cv::cudev::operator-(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ffb86ec221c92f569ae47db8d52119b',1,'cv::cudev::operator-(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab28b46e72d03a0922e710b43695f2',1,'cv::cudev::operator-(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga145db2039b6488ede1742843b830bbb2',1,'cv::cudev::operator-(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf3a6db03ab93d4b436c9f15c1e465a8',1,'cv::cudev::operator-(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6255c2cad7df67e3ad4f26a084d74747',1,'cv::cudev::operator-(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c8779b714a767af06374cf179cd7658',1,'cv::cudev::operator-(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3588ea327af30d0380dbf86c67fbbe26',1,'cv::cudev::operator-(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f7485ba0075a5d14504be9792dd6cda',1,'cv::cudev::operator-(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87cd3d2a3cfacd0af275e8f65e593c07',1,'cv::cudev::operator-(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga431f094ce3f6ed4a524c1456032d1e5c',1,'cv::cudev::operator-(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cb9157344792d1668368b76d2b53ef0',1,'cv::cudev::operator-(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e51e2db4cf854a1b534e27fef30aea5',1,'cv::cudev::operator-(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00481995ead0bbef7bcaabe8670ab440',1,'cv::cudev::operator-(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f6440ffc7c49757d421ff30eec6483a',1,'cv::cudev::operator-(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c8857ba62a6011efbd8731351b3668',1,'cv::cudev::operator-(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf70bf655a23b655608d8076f4feee13',1,'cv::cudev::operator-(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe035a4f4b0e3ea2ea1b7026a6c67dcd',1,'cv::cudev::operator-(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14497e7403c99dfbc1ff4bedc3d68f6',1,'cv::cudev::operator-(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d805c90bfeba48408241237e149aae6',1,'cv::cudev::operator-(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8a8ad77bfd017bc91c32cf644962ab7',1,'cv::cudev::operator-(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabdaef661a90228ba7259c77122b9a03',1,'cv::cudev::operator-(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e260d1cb3780fad10c72cadc0c49c0f',1,'cv::cudev::operator-(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf94b2d97816dcd6619274fb4feeae0f5',1,'cv::cudev::operator-(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2144e86d0a8c877122ccb1cbcfe55524',1,'cv::cudev::operator-(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a39a0486a0d1f390b5f009cb61d18d9',1,'cv::cudev::operator-(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcef7c7a90b8afae18f0e59c1e1ade46',1,'cv::cudev::operator-(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8802eb31440714af8c5920c08a8fbaf8',1,'cv::cudev::operator-(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf470cfb079490ca0efc9e425d8a23737',1,'cv::cudev::operator-(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b0501a5e044aaf1b9138c442f2422c2',1,'cv::cudev::operator-(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd60b5d630bd0b3ae6a4d8f53c5205',1,'cv::cudev::operator-(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1c549d5b7cc2b71327ce10502f39db',1,'cv::cudev::operator-(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99eba581458fcdf17f4e91d73459ce96',1,'cv::cudev::operator-(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c920201791dc95f7e59f0a77524a4d9',1,'cv::cudev::operator-(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf83e424e36e12a70fed05d67393f4fa9',1,'cv::cudev::operator-(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga869ba8c0391f2954ec9b51b84e4cb037',1,'cv::cudev::operator-(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286015c3a12eb08da7fee407884e7f35',1,'cv::cudev::operator-(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadece9875b31689e0880c626826fa8a14',1,'cv::cudev::operator-(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa095d5d102f9325c5700eb1fd989f69b',1,'cv::cudev::operator-(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga835e06caee26a307b42ac4b6cae3eb36',1,'cv::cudev::operator-(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f1f7629c16642fa581b16c2898a05ff',1,'cv::cudev::operator-(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf868783fdecde414693bbcb9db17628e',1,'cv::cudev::operator-(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga213848161d7be3d9c73dba5e709b079b',1,'cv::cudev::operator-(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac118a8f2d822cd667b833e12a796be34',1,'cv::cudev::operator-(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae51bb9b05a4f76f5c3a01cf3db5962',1,'cv::cudev::operator-(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d855d60a702b3918c841a26570601a3',1,'cv::cudev::operator-(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e27485d93087eacf685d1498e74f556',1,'cv::cudev::operator-(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5d66d9588e722109b30fac960662e64',1,'cv::cudev::operator-(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34688ab71722659850f777051315dc27',1,'cv::cudev::operator-(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga557b681e893a841fe02f17a00d62eaa1',1,'cv::cudev::operator-(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf80315d6f88dfcbcf02c76f8ee8f953c',1,'cv::cudev::operator-(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa89552d0de95801c80b2bb3a5e6435d1',1,'cv::cudev::operator-(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf23698f18f04d1250221e6746b4c9810',1,'cv::cudev::operator-(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fd1d6f3e17ba35584f39da603e25c82',1,'cv::cudev::operator-(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f33fccdd0d3fa940bd3f443b24f8d5',1,'cv::cudev::operator-(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ceff4b71ebb6b58c8efdb4de80df7cb',1,'cv::cudev::operator-(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236c690b63999f1e9f07c84fb1dedc5f',1,'cv::cudev::operator-(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1094d7d71d2aefc1869c72347e53d09f',1,'cv::cudev::operator-(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ce9e9e1c97e5f00df933988651acc3',1,'cv::cudev::operator-(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga183b0f68b7e993cf1d10ce74cf656f63',1,'cv::cudev::operator-(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c95d1121a4fd678e416dd219bc2eff2',1,'cv::cudev::operator-(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2c1e422a17e927b9bc13516d09691ef',1,'cv::cudev::operator-(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga377b580b41f8a05440b4a4298e79847c',1,'cv::cudev::operator-(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbdfcaf718602ea178cefb40abc3199b',1,'cv::cudev::operator-(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50daff19a60364c8d50211b6150f7bde',1,'cv::cudev::operator-(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46d693e48f72432105a7694db15cb16b',1,'cv::cudev::operator-(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c2a9c4da615af916d394e1357098827',1,'cv::cudev::operator-(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa834729f3bf1a45f6bccba9dc8df5872',1,'cv::cudev::operator-(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c42e1c911cd6ced910f9c7c39e6217',1,'cv::cudev::operator-(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28c6d90fc518cd3304a57dfc88446779',1,'cv::cudev::operator-(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07106a51535e185bcf711ed49575530d',1,'cv::cudev::operator-(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4c9e88d426e7f6991f6e34b107f56cc',1,'cv::cudev::operator-(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga00fec559cf58adaedb43c5092df36b84',1,'operator-(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6d151a3faa03d866700dd46f0ad04a',1,'operator-() const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf6a12deaeedcf12e67dc695caff1068',1,'operator-(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga657904e675f20f6b84d7821cf1b02576',1,'operator-(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5c17b1b5b5fe0b3b4e8e5bd32cbf72b',1,'operator-(const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8218dac34f71c38487a697ea52557259',1,'operator-(const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga369f1d0d8d3803abcc6e10bf145d4edd',1,'operator-(const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cccd86250a11d8e232198edf4251f14',1,'operator-(const Expr< Body > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafcebc509ca2a96c5b80ab1b96926b5c',1,'operator-(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32e53e6cd3aa0aec01a90c11008c5a',1,'operator-(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa812557e00bb932af910630701a2e6d5',1,'operator-(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga212b4e512e56d38893b3d94109f19e5a',1,'operator-(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga923d4bc9a45182d9ff86558f8c3b3e1a',1,'operator-(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf43079f133408f0dd329fa6f1d316f34',1,'operator-(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5400e7e698ff6fb2a8e8eb929b71e818',1,'operator-(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07f833d814ae15aa1f7f06fc72285d71',1,'operator-(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630122d5ecd56ab75dc7a740237d4277',1,'operator-(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga589105db257ea2341d3edecdbd69e6cf',1,'operator-(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c02a04ef1608ad485d445c8e43753b8',1,'operator-(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbd34fbbcf43515301431c8978721c7a',1,'operator-(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29b58bdfa78ef5c4d4beac53f7c79c35',1,'operator-(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae523601438b231456102587a02d29ce0',1,'operator-(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21579d3d75241e52a788ecda484e20d7',1,'operator-(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae12acf38186bf6dc6895da587665d36c',1,'operator-(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9befc50cf1641402af105f9b4ce54707',1,'operator-(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad871c5ff9bf246716e00f7215515a672',1,'operator-(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ae31a4395b49fa3b233e0c4ee9f78a1',1,'operator-(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12f0079672bd7bd0b168ce527cb706b',1,'operator-(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7852adc318a540c056ea73b49ae8286',1,'operator-(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae414e560eefa2f108503e79e0a92ce79',1,'operator-(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c78976f9105914f1896abb0b2ab712',1,'operator-(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdaf3a734933d300a18e8e1573041e6a',1,'operator-(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga595015df8ac886ee6161c8574c07b0bb',1,'operator-(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f02e96ae1741da62734d90363e15b',1,'operator-(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c2ec4b300add3f39cd2c2005fc9b03b',1,'operator-(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga671d1eab95a685d83fb46a3caedaa0e4',1,'operator-(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29088c5390150a10bd5900f805cf9562',1,'operator-(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17c6cb1c28feab2d8e488026a90f789d',1,'operator-(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c2b847a8648af7bb1bf5696a5593e1',1,'operator-(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f2cad4b2513975e900f994e6ed677d6',1,'operator-(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657470335930553724a92428b1eb9014',1,'operator-(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa406a939d82354cec9279667daa1ca94',1,'operator-(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b895e1f04d72d46b19f80936c9c0704',1,'operator-(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49370160c90b69f0c6e98c898b527368',1,'operator-(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f5ba88d0b852d2f86afc29e06f1e8a',1,'operator-(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97c585e4f802affa218b50922504b4d7',1,'operator-(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b8b588d37850f2a9d96602a6a5f7d67',1,'operator-(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga222ce3784f3fc6433767ce8cdaa827f7',1,'operator-(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2828d795db4524ad86acf6438336fa',1,'operator-(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2684b612027b487618841db6c1850313',1,'operator-(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7d0852b020342bc37b7e507a587905a',1,'operator-(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9529413b121c4e0c8ee22482a4fab970',1,'operator-(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5bf61216767dfa9c63290c776fc9dc30',1,'operator-(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafffe9e12abf7a2013c656198bbfe4019',1,'operator-(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f600b61f1a94b779ce862a1b2ddc83e',1,'operator-(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3492f3658fe0c7b45d288f0700124307',1,'operator-(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0ec17613882c822c1684d5e67aa3ff0',1,'operator-(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01f9a0cf5655a5f3c4c2e78bde998754',1,'operator-(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c66bc85731db1174c2eae7646fe8ae',1,'operator-(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd83b96a13731954f8723e2275e3765',1,'operator-(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157fca7e19a61dbf087d7654594d4e23',1,'operator-(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55f1af68b4a753b3a6a3e078d91f1696',1,'operator-(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf4e04da6c7b24130e4cc8e776a5339a',1,'operator-(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73809cf57d17ff44a52c02c3b29ecfba',1,'operator-(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6d871842daa1c70ea4caef8a76670ab',1,'operator-(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3923c285bfc32ef157d97af42b4dbaa',1,'operator-(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3091968102f4293b8a37fa22c26fde15',1,'operator-(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga105d05b599ef729df2112db1626078c9',1,'operator-(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fc141b8ac2f6e3aeba0e32424591d9',1,'operator-(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c28d9ff3a737dfe37508d1608d4488',1,'operator-(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace86d625860816056a815a5ac249841f',1,'operator-(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c83494077d790efb9cce651ef5c8fb3',1,'operator-(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fcb4deeb33df8bb7fabc3afdc922947',1,'operator-(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d0e94e2a3ddb20e082a36b760b374c',1,'operator-(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf528d8dbd1cb9132a7d8acc3f11b0a89',1,'operator-(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd1c46a4dceccd18eff03077f8e8da83',1,'operator-(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26feff449ac4dab327561cc7b98ae303',1,'operator-(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f0d316266abadce36d9f95350939051',1,'operator-(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a790596a24ef36db89348e75d2858c',1,'operator-(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cebc4fe6b6f94f836752ced678af6d6',1,'operator-(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7912128120aa37fc63d046a614da79',1,'operator-(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31fa210affd71e287fb5e9b483d8b4b7',1,'operator-(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39a6f71ae25763350c835bab9dde6025',1,'operator-(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c17045262474d8006617bf00a10ada',1,'operator-(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3af755936e984d2d83fe6b1f520d014',1,'operator-(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff766239f9095c4845abc49acf0e2dd0',1,'operator-(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga750fd24726debf7081fb1118125a6775',1,'operator-(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae62193899bb9cc343fa962b4b521e36c',1,'operator-(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166ed0bcb9dd638829729f92695b12d0',1,'operator-(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80d8077257094293bb466dab861ac473',1,'operator-(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772e599865fe047c41f93d58af5c36be',1,'operator-(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d7fa5317dd05a15f21aa3be368d6c79',1,'operator-(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafecaf20edf9038a419b4963a649f1362',1,'operator-(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a7b9dbe190b22a08f72e3f9334e3171',1,'operator-(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60818b7e8929ee3491aad14dc0bbf7e7',1,'operator-(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55574f511139402e4cd6820b2e3edeba',1,'operator-(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9d8281a359296fae7b6ec188101ed8e',1,'operator-(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7dad42ade73d46813a094b64808c6b8',1,'operator-(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d789399fa52f9690e6e01fe8d653bc9',1,'operator-(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24bad9cc2b3b3ac10c819d8fd2ae54e',1,'operator-(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga064176b3aa847d4e254c1ec1db3f8324',1,'operator-(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb5d9702bcfe0a2527b510cc84938a4',1,'operator-(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga459d5db54e31c46b4c5982f98e42fa77',1,'operator-(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb64bc3f5c6ee79fc1869e51e0e20ea',1,'operator-(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab72d0df44e48d58d0a83680bcc64c0cd',1,'operator-(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f14ce38edfb19ba6890f42c9e4bc1c7',1,'operator-(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ca19596afc498b95a6a7b19375e2776',1,'operator-(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga830cd97a436668d9feeb2ff08daead24',1,'operator-(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0447438f3f039aaf24fe21d502153a6c',1,'operator-(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac95b6a94f1155b246a18f3b845e3cfa7',1,'operator-(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabecf086f97f0c60573f81155ce6df359',1,'operator-(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa1778a2f54eb6eafc3a395173fac5b',1,'operator-(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c69722cf7d46b2ca923926d0a9e7c29',1,'operator-(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301f25e5157f16b4a044760a1ba51957',1,'operator-(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga234301df3e003ce08fa1154a6919c3e6',1,'operator-(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga529a4056534c5e47aa59d256ad69795b',1,'operator-(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe950dd17a8fa089fe286dc7513ed18b',1,'operator-(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51346e7356a9c330b5874b3e3e8fdf7a',1,'operator-(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga087dd0f490602b7f5212a8221cc4c631',1,'operator-(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa922d047700892efb47a39e2b66e2df7',1,'operator-(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga030665610f8a68470affbb8fc223480a',1,'operator-(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9334f4344c1d1203f4e78bad75c7f7ac',1,'operator-(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c175694697819d86c134405fef567d',1,'operator-(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c871fd39d365299a7087e48c132e66',1,'operator-(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35c6854bb46e9164eec0218f869a9b9',1,'operator-(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97621dfd01d12393ecd93025efb3565f',1,'operator-(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb1c3da793075b09989fc44ae3f1b9ed',1,'operator-(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f6f8843f95be97da2d9dd97203a57a7',1,'operator-(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4b21b2c12c7e804eff3159893bf0da',1,'operator-(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f8acd15bb673d2ddb88d3fc032f7f46',1,'operator-(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b1a551cfaf5a99c6fe30782af1dee38',1,'operator-(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8718012438f8242708e0e7c59e30c0f3',1,'operator-(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b256b2cc48a9181623a38977e3bac00',1,'operator-(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58ed6ef928b50877a894f409e8464ac2',1,'operator-(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77dd6b885a2b9b9b4c44d74be2dbfd74',1,'operator-(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga599164264373b33e0a535211c0fdccb5',1,'operator-(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99636b5731e60af2c22851c30f4e1cc2',1,'operator-(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f068655bf1a117d63ee8d12c9123bc',1,'operator-(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68155cb7567a70e34854e308bad38bf0',1,'operator-(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6789124b74d1f4bd32bcbbf0501d6bd',1,'operator-(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c14a811c0156b0a39c727300af59a3d',1,'operator-(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628b15bea2200f623235e780644b4738',1,'operator-(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaed8862546424053275a74eb182123b1',1,'operator-(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf917f33a395906b4ee4b0d09d3abb4fa',1,'operator-(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c898d588a40dd071eec1f8c2c74b39f',1,'operator-(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd0d6d85ac669a3f90307e30aa3cbe00',1,'operator-(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e5740217efa8fe0abf0abcc760328d',1,'operator-(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9dd88cc2cbce6d9e4778d60fc7921f7',1,'operator-(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b9334faac50e773d70fc8dfd0b5ecbe',1,'operator-(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e525a4e0063c46db0f94eeb30818210',1,'operator-(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81998f25744b975fc9ad36d109ac830b',1,'operator-(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd199a5f6d3af032060b2c2d22651ba0',1,'operator-(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587458f4a3b6baaae54d1bf38c608fdd',1,'operator-(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c43181792568fdac96ab1f34606f45',1,'operator-(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad30d5dabcda24d862172a45f57790b0d',1,'operator-(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71cc98fe99d705fe3f356355a5972c54',1,'operator-(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae1659d27c0d33e75d72445deaf55930',1,'operator-(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98feed4df5a73a8ddd6d51b8321af344',1,'operator-(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b4b59a36beb43c49f01fb86f1bc890',1,'operator-(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0775017854d4e2b772d672168bd9a5c',1,'operator-(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b1fa561df0ed7972108d66f89c5c496',1,'operator-(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf9102f7c51e3a2d88b9073206820a55',1,'operator-(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2316196b4a8bd1c46e519dd2fc4c3851',1,'operator-(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3075a67dd4ae9b7543c5e4c897f5ff45',1,'operator-(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9ba6b5d0f5f1a8ed6d93e4f0ab5e173',1,'operator-(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedcf75a12dd00e1c503c9106e44a3e98',1,'operator-(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01b9153cf9b4f0369155cb594e2d1349',1,'operator-(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ff1bf6c7c124e0c8bd913479790866a',1,'operator-(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabed2cc5868115ee18468aa3cebb3be19',1,'operator-(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e312d4b86154b204240572d9e86effd',1,'operator-(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0418e4172197c9fa9dcd41c9fb3b20f9',1,'operator-(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b532e3190010cf8358b124e3dde328',1,'operator-(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195ae36c11666e48a9947af768d97b44',1,'operator-(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b120b8e056fc331b8069bf1a9ed6fff',1,'operator-(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8362b5b231be23340c5fb8b99cbb375e',1,'operator-(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga082c28863107b352ac51038a23d06300',1,'operator-(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga915ab09a582414ca39929cdb812f758a',1,'operator-(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ea8ddbac826668fdc04ab8f99e66d9',1,'operator-(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc941af3597d7061a0661159a5469162',1,'operator-(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94ea2c59d0991a2fc0298c7f5a24e50',1,'operator-(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2270da17955731575fe008dc96c80bda',1,'operator-(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ffb86ec221c92f569ae47db8d52119b',1,'operator-(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab28b46e72d03a0922e710b43695f2',1,'operator-(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga145db2039b6488ede1742843b830bbb2',1,'operator-(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf3a6db03ab93d4b436c9f15c1e465a8',1,'operator-(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6255c2cad7df67e3ad4f26a084d74747',1,'operator-(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c8779b714a767af06374cf179cd7658',1,'operator-(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3588ea327af30d0380dbf86c67fbbe26',1,'operator-(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f7485ba0075a5d14504be9792dd6cda',1,'operator-(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87cd3d2a3cfacd0af275e8f65e593c07',1,'operator-(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga431f094ce3f6ed4a524c1456032d1e5c',1,'operator-(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cb9157344792d1668368b76d2b53ef0',1,'operator-(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e51e2db4cf854a1b534e27fef30aea5',1,'operator-(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00481995ead0bbef7bcaabe8670ab440',1,'operator-(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f6440ffc7c49757d421ff30eec6483a',1,'operator-(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c8857ba62a6011efbd8731351b3668',1,'operator-(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf70bf655a23b655608d8076f4feee13',1,'operator-(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe035a4f4b0e3ea2ea1b7026a6c67dcd',1,'operator-(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14497e7403c99dfbc1ff4bedc3d68f6',1,'operator-(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d805c90bfeba48408241237e149aae6',1,'operator-(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8a8ad77bfd017bc91c32cf644962ab7',1,'operator-(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabdaef661a90228ba7259c77122b9a03',1,'operator-(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e260d1cb3780fad10c72cadc0c49c0f',1,'operator-(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf94b2d97816dcd6619274fb4feeae0f5',1,'operator-(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2144e86d0a8c877122ccb1cbcfe55524',1,'operator-(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a39a0486a0d1f390b5f009cb61d18d9',1,'operator-(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcef7c7a90b8afae18f0e59c1e1ade46',1,'operator-(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8802eb31440714af8c5920c08a8fbaf8',1,'operator-(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf470cfb079490ca0efc9e425d8a23737',1,'operator-(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b0501a5e044aaf1b9138c442f2422c2',1,'operator-(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd60b5d630bd0b3ae6a4d8f53c5205',1,'operator-(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1c549d5b7cc2b71327ce10502f39db',1,'operator-(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99eba581458fcdf17f4e91d73459ce96',1,'operator-(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c920201791dc95f7e59f0a77524a4d9',1,'operator-(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf83e424e36e12a70fed05d67393f4fa9',1,'operator-(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga869ba8c0391f2954ec9b51b84e4cb037',1,'operator-(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286015c3a12eb08da7fee407884e7f35',1,'operator-(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadece9875b31689e0880c626826fa8a14',1,'operator-(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa095d5d102f9325c5700eb1fd989f69b',1,'operator-(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga835e06caee26a307b42ac4b6cae3eb36',1,'operator-(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f1f7629c16642fa581b16c2898a05ff',1,'operator-(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf868783fdecde414693bbcb9db17628e',1,'operator-(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga213848161d7be3d9c73dba5e709b079b',1,'operator-(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac118a8f2d822cd667b833e12a796be34',1,'operator-(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae51bb9b05a4f76f5c3a01cf3db5962',1,'operator-(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d855d60a702b3918c841a26570601a3',1,'operator-(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e27485d93087eacf685d1498e74f556',1,'operator-(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5d66d9588e722109b30fac960662e64',1,'operator-(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34688ab71722659850f777051315dc27',1,'operator-(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga557b681e893a841fe02f17a00d62eaa1',1,'operator-(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf80315d6f88dfcbcf02c76f8ee8f953c',1,'operator-(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa89552d0de95801c80b2bb3a5e6435d1',1,'operator-(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf23698f18f04d1250221e6746b4c9810',1,'operator-(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fd1d6f3e17ba35584f39da603e25c82',1,'operator-(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f33fccdd0d3fa940bd3f443b24f8d5',1,'operator-(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ceff4b71ebb6b58c8efdb4de80df7cb',1,'operator-(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236c690b63999f1e9f07c84fb1dedc5f',1,'operator-(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1094d7d71d2aefc1869c72347e53d09f',1,'operator-(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ce9e9e1c97e5f00df933988651acc3',1,'operator-(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga183b0f68b7e993cf1d10ce74cf656f63',1,'operator-(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c95d1121a4fd678e416dd219bc2eff2',1,'operator-(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2c1e422a17e927b9bc13516d09691ef',1,'operator-(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga377b580b41f8a05440b4a4298e79847c',1,'operator-(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbdfcaf718602ea178cefb40abc3199b',1,'operator-(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50daff19a60364c8d50211b6150f7bde',1,'operator-(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46d693e48f72432105a7694db15cb16b',1,'operator-(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c2a9c4da615af916d394e1357098827',1,'operator-(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa834729f3bf1a45f6bccba9dc8df5872',1,'operator-(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c42e1c911cd6ced910f9c7c39e6217',1,'operator-(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28c6d90fc518cd3304a57dfc88446779',1,'operator-(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07106a51535e185bcf711ed49575530d',1,'operator-(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4c9e88d426e7f6991f6e34b107f56cc',1,'operator-(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaab018c47cc4e8f0dfa471622a784677b',1,'std::operator-(const complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5c472f8066a2430d37e23f0c29c45718',1,'std::operator-(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9fb72f354a48fc4332fed44a47c562fd',1,'std::operator-(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga526ecc839bcebb2dbb970cee1d3de8d3',1,'std::operator-(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga9098fadcbe59e0ba2fa8590bd8388f5e',1,'std::tr2::operator-()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaab018c47cc4e8f0dfa471622a784677b',1,'operator-(const complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5c472f8066a2430d37e23f0c29c45718',1,'operator-(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9fb72f354a48fc4332fed44a47c562fd',1,'operator-(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga526ecc839bcebb2dbb970cee1d3de8d3',1,'operator-(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga9098fadcbe59e0ba2fa8590bd8388f5e',1,'operator-(const dynamic_bitset< _WordT, _Alloc > &__x, const dynamic_bitset< _WordT, _Alloc > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga028b49a6d0cf1f6afa48149603d953b2',1,'operator-() const(Global Namespace)']]], - ['operator_2d_2d_113',['operator--',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a792a43266d40b85aca7fd5ccce99a689',1,'cv::MatConstIterator::operator--()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a9ebb7e43682a724ce28d8715fc29a783',1,'cv::MatConstIterator::operator--(int)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#acd66a482fbc19586f2dfd47ebba6b448',1,'cv::MatConstIterator_::operator--()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ab07d8d0b89c903f779a021c2c97c8420',1,'cv::MatConstIterator_::operator--(int)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a7882f8680fe5a579a8cff9e77b876e34',1,'cv::MatIterator_::operator--()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#aacbd0bc9e0eccb76169a7bc3188527ad',1,'cv::MatIterator_::operator--(int)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a240e65582faf3f08a0cc9268063efdf0',1,'cv::SparseMatConstIterator::operator--()'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ae1e53a3cb951f9c3647c18e160fa124f',1,'cv::SparseMatConstIterator::operator--(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a013970df0401622fc82f1e3b4aafeb73',1,'std::reverse_iterator::operator--()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#ac7ab8ae9e2d74a1456d6d835e3de74e5',1,'std::reverse_iterator::operator--(int)']]], - ['operator_2d_3d_114',['operator-=',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a881e7011fee862380940bef019551dc6',1,'cv::MatConstIterator::operator-=()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#af05c490f19f8e10d3d81c7697e007e98',1,'cv::MatConstIterator_::operator-=()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ad0d1fe9aba83851f42462de9365268a2',1,'cv::MatIterator_::operator-=()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'cv::Matx::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'cv::Matx::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< _Tp, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< _Tp, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 1, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 1, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 2 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 2 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float_type, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float_type, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga27579376dfdbd8e4ffcdb7b3f0b7efe8',1,'cv::softdouble::operator-=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga855ef9ba871cb9fb4c2f7034966af711',1,'cv::softfloat::operator-=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'cv::Vec::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'cv::Vec::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< _Tp, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< _Tp, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a6e9d5332bf641e4bebfc4d94b407bfd0',1,'std::complex::operator-=(const _Tp &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaacea589517bdac6f85963e345f09ee17',1,'std::complex::operator-=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#af98737e3474e12ecb9d40f19bea2ea9e',1,'std::fpos::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac25a53dfa03677767990c5a3af186cf8',1,'std::gslice_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8eb0f010a6a61d5066af1b3e757b87b9',1,'std::indirect_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7e8b4e636a4ccb6a93f289308d2d6c7e',1,'std::mask_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a194e833ea2d84161f1bf3f996d1d1d5f',1,'std::reverse_iterator::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaaa8967e72a60fc2b6f8f422dc970ea1f',1,'std::slice_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a821d3b176095151a3557a0aa6f7871e4',1,'std::tr2::dynamic_bitset::operator-=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a821d3b176095151a3557a0aa6f7871e4',1,'std::tr2::dynamic_bitset::operator-=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4667f35667105d1ec1aa3e763c503cd4',1,'std::valarray::operator-=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e7ec75f9c2dd61177a35d939ce85f11',1,'std::valarray::operator-=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4667f35667105d1ec1aa3e763c503cd4',1,'valarray< size_t >::operator-=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e7ec75f9c2dd61177a35d939ce85f11',1,'valarray< size_t >::operator-=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#aac76a5e5e735b97f955189825cef7e2c',1,'Eigen::ArrayBase::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#aac76a5e5e735b97f955189825cef7e2c',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1042124b0ddee66e78ac7b0a9ac4cc9c',1,'Eigen::MatrixBase::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1042124b0ddee66e78ac7b0a9ac4cc9c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1042124b0ddee66e78ac7b0a9ac4cc9c',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a79ff0326cd78da5bb2bdc4a88f5428c9',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'Eigen::VectorwiseOp::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Derived, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Derived, Vertical >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator-=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gad5ad464e467385af9b4183e1689fa720',1,'cv::operator-=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga855ef9ba871cb9fb4c2f7034966af711',1,'operator-=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga27579376dfdbd8e4ffcdb7b3f0b7efe8',1,'operator-=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gad5ad464e467385af9b4183e1689fa720',1,'operator-=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaacea589517bdac6f85963e345f09ee17',1,'operator-=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac25a53dfa03677767990c5a3af186cf8',1,'operator-=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4667f35667105d1ec1aa3e763c503cd4',1,'operator-=(const _Tp &)(Global Namespace)']]], - ['operator_2d_3e_115',['operator->',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#af9c384816f316388b844f764d50c5ef7',1,'cv::util::optional::operator->()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a656e8f03c9c93365ad168cc141682658',1,'cv::util::optional::operator->() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#afff5687d9255ad33daa6780dda27b6c5',1,'__gnu_debug::_Safe_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a4789f11d5d5c248e478a79f590186f1a',1,'__gnu_debug::_Safe_local_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a60137368e9df33aaca43271c842f0dea',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a60137368e9df33aaca43271c842f0dea',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a2096ba7f4be3c22e0f883172ba323f5c',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a2096ba7f4be3c22e0f883172ba323f5c',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#afff5687d9255ad33daa6780dda27b6c5',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#afff5687d9255ad33daa6780dda27b6c5',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a4f35a84ace173bc8b49e7b15af544bdc',1,'const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#ab0ed1f338073d1926501cc11769724d9',1,'iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a4f35a84ace173bc8b49e7b15af544bdc',1,'point_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a281f49eca5033b2d2bd3c5f369bdb9e0',1,'point_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a26129c2150ef03c1d8d33a3bbe65ef23',1,'std::auto_ptr::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#acff5a9bfb1ef4383f413ea2cc8f6ef7d',1,'std::regex_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#aec95fbb6d9ff5cca02e86c2f8bdd3de9',1,'std::regex_token_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#ab256f3da0cdc3212fd9f676e70fcfa74',1,'std::reverse_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'std::unique_ptr::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Codecvt >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Res_type >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Result< _Res > >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Result_base >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< bool[]>::operator->()']]], - ['operator_2f_116',['operator/',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4fd7c94c36187ae1dd810e5e1cb98506',1,'cv::MatExpr::operator/(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9f4860191ebc911882258adb3ed81220',1,'cv::MatExpr::operator/(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7d490d89368ae09a8034d3ef145f1b75',1,'cv::MatExpr::operator/(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6f76b7cbb9b728896ffb90522796a1c7',1,'cv::MatExpr::operator/(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27472a7b10eb061860f2d44e91ce2016',1,'cv::MatExpr::operator/(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aa27acc5fc0baa71648720825da8d7c8d',1,'cv::MatExpr::operator/(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af1c42ad483f7b6947e17db0c508c4292',1,'cv::MatExpr::operator/(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a296be1bafb9c82f8fd4ec55ea5f3ef81',1,'cv::MatExpr::operator/(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af0227aa2a8b2fb11495e9efc2ce8a9b6',1,'cv::MatExpr::operator/(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a86f61f74c4c8c305218ab7f6e1ad7f87',1,'cv::MatExpr::operator/(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4fd7c94c36187ae1dd810e5e1cb98506',1,'cv::MatExpr::operator/(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9f4860191ebc911882258adb3ed81220',1,'cv::MatExpr::operator/(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7d490d89368ae09a8034d3ef145f1b75',1,'cv::MatExpr::operator/(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6f76b7cbb9b728896ffb90522796a1c7',1,'cv::MatExpr::operator/(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27472a7b10eb061860f2d44e91ce2016',1,'cv::MatExpr::operator/(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aa27acc5fc0baa71648720825da8d7c8d',1,'cv::MatExpr::operator/(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af1c42ad483f7b6947e17db0c508c4292',1,'cv::MatExpr::operator/(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a296be1bafb9c82f8fd4ec55ea5f3ef81',1,'cv::MatExpr::operator/(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af0227aa2a8b2fb11495e9efc2ce8a9b6',1,'cv::MatExpr::operator/(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a86f61f74c4c8c305218ab7f6e1ad7f87',1,'cv::MatExpr::operator/(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga995d0eb099efa09893b36adecda4243a',1,'cv::softdouble::operator/()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaad5d6d10fa57557f159b67b9618bf557',1,'cv::softfloat::operator/()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'Eigen::VectorwiseOp::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Derived, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Derived, Vertical >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator/()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga73e22cc4b1f8a3132abc30677ed531c4',1,'cv::operator/()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63c10edfae5414877b679eeb58c9f4a7',1,'cv::cudev::operator/(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2abad8ee149156b1c5538b6fc541638',1,'cv::cudev::operator/(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1a1c4ccd594dd41d946649a7ab1ca3',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfba9463c82a223ac76103d9bcf16aa0',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1782e839b0d1c68438dbecfcac2820ac',1,'cv::cudev::operator/(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabaec01b86941bbff223af9d2c29e68bc',1,'cv::cudev::operator/(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0f36028b3f87632fbadae1cf5f2d03',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8314510e1d4316367ac391f110059454',1,'cv::cudev::operator/(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9036097b144dbf93817c5ef126d116d0',1,'cv::cudev::operator/(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8db65d14cd813f8d457b921c39bb27a8',1,'cv::cudev::operator/(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c6b1c78bd2dbea3ea062235736e7329',1,'cv::cudev::operator/(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d4687efb816dcbc5a403deef46acdb',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3bfcae1affcdf5e57f963f93722a04c3',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa73d74035bcb8e99515b0e082068845',1,'cv::cudev::operator/(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26c9c7aac034c3c77d2c7fcafb2b7324',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b20a16f030f203ca1246b182ee58fd5',1,'cv::cudev::operator/(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89c3f0a954a006a68c412300414e17de',1,'cv::cudev::operator/(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520991356f52a0254059d9542c16006',1,'cv::cudev::operator/(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ef2415aa67752f6a252d4f7d068a526',1,'cv::cudev::operator/(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68da45fdf82b957dbb2cf14a027c0322',1,'cv::cudev::operator/(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67a4465bc93192a57e10555bccc96bda',1,'cv::cudev::operator/(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga906b0deabff7997bb4d80ae166a137c3',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a7b51f10d165feaae86cd0bc18e91e1',1,'cv::cudev::operator/(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a6cbf801c763c54dbd07832815194bd',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52e5285f48a908e86ff891aed2d743f2',1,'cv::cudev::operator/(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a2a30fd3e15d27a99f3b7d1917f9e38',1,'cv::cudev::operator/(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga624a50622e8a386f768ef3190ef08ba8',1,'cv::cudev::operator/(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac63ba9fe41878226447c261efbb516c1',1,'cv::cudev::operator/(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga436022693ffe3e23663fa33b1512e777',1,'cv::cudev::operator/(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5877c60845ecd0eb7145b119e6513b55',1,'cv::cudev::operator/(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ef3fffb48e92a7a50f3851c5fb7338b',1,'cv::cudev::operator/(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad520b1c01bd7118c82548f6cb020238f',1,'cv::cudev::operator/(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae93cb2fb69f84957b45190513bc4ac38',1,'cv::cudev::operator/(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadff98c44d9758083f04c7eee4e7d5a3e',1,'cv::cudev::operator/(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga549d0f141917aec8ef972c77971c1084',1,'cv::cudev::operator/(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508053e4393ce90846ce4974907d317a',1,'cv::cudev::operator/(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga583198460ba33f63a71a030fb51ea4ec',1,'cv::cudev::operator/(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a8182f4c0412f05ec96d4f734619f65',1,'cv::cudev::operator/(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae209c1b38d254292bf2ff0ca617d96bd',1,'cv::cudev::operator/(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7ce642e9cb3aad8237b74e57545ec0',1,'cv::cudev::operator/(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc358c56da85f1e9fb45ec4379aef819',1,'cv::cudev::operator/(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37633241bee5b78408d690bea4d6bc97',1,'cv::cudev::operator/(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182216df7f15de3724ac89de6dbbdc08',1,'cv::cudev::operator/(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24d234d3496e5365fcc0181c864bee8f',1,'cv::cudev::operator/(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84226e77b868bda78abaa855e431f83b',1,'cv::cudev::operator/(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5065b677cee6eaf61c4990fab2fef59b',1,'cv::cudev::operator/(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45b4e9375b6e30685cc40474d84ccf02',1,'cv::cudev::operator/(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2025f63f3d90e41dec633bedd58357e',1,'cv::cudev::operator/(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86d40a00cbb232d5d72ba19ec81ed438',1,'cv::cudev::operator/(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc622e639c83e90f061aea4d908af53',1,'cv::cudev::operator/(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8126bd6f60da8d7fcb39cb6abd253bdc',1,'cv::cudev::operator/(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae06070c3075afe5424512508edb81586',1,'cv::cudev::operator/(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga460f926abfd82d2b3f91e886ee6d6aa4',1,'cv::cudev::operator/(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19e6a6945b5af142801ced01b619f993',1,'cv::cudev::operator/(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaade20eaaba20908f19ea46982534d36f',1,'cv::cudev::operator/(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d97c6ab31477097c28510e7b449979f',1,'cv::cudev::operator/(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07c8153666fa828bf51ba1df3d037641',1,'cv::cudev::operator/(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace9317803db502fe7a302c33e81fde41',1,'cv::cudev::operator/(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04b6dbca2658111aa32e4b32f88e3d29',1,'cv::cudev::operator/(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb7d476559b303db2472d6effecb2f89',1,'cv::cudev::operator/(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab32e30453cfc72ff1b0aa78c8a1b2d',1,'cv::cudev::operator/(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfda695bfc877ea25dbf96d5b554676',1,'cv::cudev::operator/(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3addc09f491a734516e0b7dd2b44179',1,'cv::cudev::operator/(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a4539fab45842a06a5edecc85beb00',1,'cv::cudev::operator/(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad727324599c518090bdfccf7b8e08c22',1,'cv::cudev::operator/(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5db301a86ed3528e1ae4d332a6f30fd2',1,'cv::cudev::operator/(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53358badb500dfd70e070cf1ebfd0a18',1,'cv::cudev::operator/(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56dffbd26015a50c0bc5aa6ebb742c31',1,'cv::cudev::operator/(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac92b8e55ec04f04b2c031123d997c266',1,'cv::cudev::operator/(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987dcefef0b62d8bc37af554235fe0ef',1,'cv::cudev::operator/(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab67eafd771d2282a502fdbd6c54ead06',1,'cv::cudev::operator/(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ab843a5f0b70aad934d6c3e5c5b8257',1,'cv::cudev::operator/(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga947ed5817156d062129c8903c0603e95',1,'cv::cudev::operator/(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5eed4cb9d49becaa49611f544539d206',1,'cv::cudev::operator/(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05241f798415de42c5da5c69c55aef11',1,'cv::cudev::operator/(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf24592373ca8cb6278d42bd53e8184a',1,'cv::cudev::operator/(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99f77817f5ca8058516194a9dd63c283',1,'cv::cudev::operator/(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed1bde145568955c9f1131d91a4e0614',1,'cv::cudev::operator/(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cc5fea7eec39d991a9bca1c5d65f450',1,'cv::cudev::operator/(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2564bcebc93bb19ad1ef13ad520ed4d',1,'cv::cudev::operator/(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6829aff16fde91d0e7465d0fb6e62913',1,'cv::cudev::operator/(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50208cff6a446a4b35ac2f8688eebce0',1,'cv::cudev::operator/(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa97fbcd1bc2ad1f58b02b567645c9d61',1,'cv::cudev::operator/(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga816379a4f078d68b1c4c351dad009189',1,'cv::cudev::operator/(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabef9e42d02bba8884bfad5fbe70bbada',1,'cv::cudev::operator/(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17a0b78772e84b3e73b6890b49d340e1',1,'cv::cudev::operator/(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga794491c37dd2df850f3893138414353a',1,'cv::cudev::operator/(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b08fc0b7dbd5277deb26cdc85008b2d',1,'cv::cudev::operator/(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b04679db179bda54f1e9d0d2673ffc4',1,'cv::cudev::operator/(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8034cd977168fcbeb64d0f143c27dd6c',1,'cv::cudev::operator/(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad760f8b985f9f78e6f7cfae125c57952',1,'cv::cudev::operator/(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab37aec5734a505aa76159bb43f68a636',1,'cv::cudev::operator/(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c116242125c2ea7d6aaef804c309757',1,'cv::cudev::operator/(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ba61529ddd1ed3f0329c56b834999a1',1,'cv::cudev::operator/(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga113d7371aab51f681e1e5e82d268c3ee',1,'cv::cudev::operator/(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65207a98a6ba24f91f6d735a88c4ae11',1,'cv::cudev::operator/(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4cab124d95ea36b40f41915cb6c52e',1,'cv::cudev::operator/(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c0325622303ec37f5a35fdb5acb4aba',1,'cv::cudev::operator/(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51668d8071ec45f300736c84386a95de',1,'cv::cudev::operator/(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ba06691317169f995b1e4f84af326f',1,'cv::cudev::operator/(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cd026898af4d75be94752d39ea86285',1,'cv::cudev::operator/(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f6d00516b5705d5b0bfe98574781f29',1,'cv::cudev::operator/(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf2e26c94589161b5aa1ff904b3d91c1',1,'cv::cudev::operator/(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1fd8b99c66de2ff572d583fd379f9a3',1,'cv::cudev::operator/(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga941fdc20547d924ada48cfb0e59957c2',1,'cv::cudev::operator/(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147f7c5b249d5eec2f5edbe9d663f023',1,'cv::cudev::operator/(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a2f63e1448c1423a462cb3802dbc1fc',1,'cv::cudev::operator/(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f9f5d4955d4910a88edc28d264773a',1,'cv::cudev::operator/(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788722f37dc7eedf7369be91a27b2baf',1,'cv::cudev::operator/(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0784968a2beace1b43d5bfcad6895bf8',1,'cv::cudev::operator/(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4107f0212b5bd97903dbc0fd113a55bd',1,'cv::cudev::operator/(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f7aee12ad93a7ddeb22a39e77fbb649',1,'cv::cudev::operator/(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86164b5b800cbf1a1bc1da69dc6b1cea',1,'cv::cudev::operator/(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffb8f750584cbf3428cca25579fa9e0e',1,'cv::cudev::operator/(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddffd612d0a062ab2c7c63f809d32103',1,'cv::cudev::operator/(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8efa47e085c080af09f59676bce38003',1,'cv::cudev::operator/(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3701eb47de8686f78f358575ee69eab',1,'cv::cudev::operator/(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4996cdd2cf5b7d7f88201b3280b9b882',1,'cv::cudev::operator/(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efd1425a4f37f08505df7138be39786',1,'cv::cudev::operator/(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb65bc0269df370c51277a668fcdcc73',1,'cv::cudev::operator/(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa92a62d328a8ab3e85e80b52693d156c',1,'cv::cudev::operator/(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72f5c3ec2dbedb3f1150559435cb430b',1,'cv::cudev::operator/(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391153a0840528f075a6fc407e841c10',1,'cv::cudev::operator/(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadeb192837562e5c4b8d82f8ab38bf084',1,'cv::cudev::operator/(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2f238b633143c3e6b22b2b8579c53e',1,'cv::cudev::operator/(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f1ef76972820abe1d3a3ae91e95de4',1,'cv::cudev::operator/(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15fa7ad89e9bafc4993276448a0d3bd5',1,'cv::cudev::operator/(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab15f13356b2c04e4c2c4cebdcf6e4b',1,'cv::cudev::operator/(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafae9c481f30b10a2c900bf4a4da08af8',1,'cv::cudev::operator/(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7ca775d4ec4865729ecdc345dab1e30',1,'cv::cudev::operator/(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade1df8d73b8ac8fb3fd2fb853a0c187a',1,'cv::cudev::operator/(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe8737c01957c40118140eec1bf68d9',1,'cv::cudev::operator/(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6c52b2d2d236023ea59691301f17cc',1,'cv::cudev::operator/(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8435aa501c96247ea59d3ea8b947117e',1,'cv::cudev::operator/(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga828cee39fcbf51a1644d44510c12b7b4',1,'cv::cudev::operator/(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c5f0b61d269ea3a00f58a1b80b09aa5',1,'cv::cudev::operator/(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94a4aa6688bbf6fb5dbe16962cf49041',1,'cv::cudev::operator/(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ac2bcd0e1c58eabcbba3caa878be93f',1,'cv::cudev::operator/(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fccb24eadfc89075e1380c4a840226d',1,'cv::cudev::operator/(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f329583283b38d835e5111baa0e9ccb',1,'cv::cudev::operator/(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac224098894c2dd93c45d36ce0aa2d8f0',1,'cv::cudev::operator/(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf34d47c8fc399c1b5633a81e0a2a20aa',1,'cv::cudev::operator/(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64c7907250e45a962209e2c4c8e3860d',1,'cv::cudev::operator/(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1db39b81ceb79ce30d5ff502387a0172',1,'cv::cudev::operator/(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e6457d8d8908556e5a6623bca43f0d5',1,'cv::cudev::operator/(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22b5c96ff38d1d48b10aabad0e49be7b',1,'cv::cudev::operator/(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdf50d97f13cd4161262f9f7152c936c',1,'cv::cudev::operator/(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga317fc707d6c32eb0344e606c409cd502',1,'cv::cudev::operator/(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0dd8315bf86df24af59d7a26804f4af3',1,'cv::cudev::operator/(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca9088b2f5335ee8214a1dfbc42fd1d',1,'cv::cudev::operator/(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1aaea7b03c2dff6baf65f0054823b44',1,'cv::cudev::operator/(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49c5598a8d2bcf1957abd74da1c06936',1,'cv::cudev::operator/(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d4fa53f21d88b5d9fa07222b90ee3c',1,'cv::cudev::operator/(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c71abb3cec3af512f67e4b7134f4870',1,'cv::cudev::operator/(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9763eb69ace36e922bdc23adf58fa071',1,'cv::cudev::operator/(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6426caf4d84767c4f4b4df77b4bd8f7',1,'cv::cudev::operator/(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b4c3fadce268d79da7c2e33e1aa8ac',1,'cv::cudev::operator/(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fda9fbfd0224f6806547e77bbc9bbec',1,'cv::cudev::operator/(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c9e4aecc482aeae0ebd4fc37b1efd7',1,'cv::cudev::operator/(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeffd81f4b90d5e1fb4f7d8658d595a73',1,'cv::cudev::operator/(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae885e6e18ed764df65cc712846fbcf82',1,'cv::cudev::operator/(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e271106bb16c64506b78f50599ffad0',1,'cv::cudev::operator/(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2af76884f887a6bae64783d7cfa3fd5',1,'cv::cudev::operator/(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga216608449d27058bfa3427d67089019b',1,'cv::cudev::operator/(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85aa004a5cb3b6108b0041ad11574367',1,'cv::cudev::operator/(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a42711792e9b1ed79c25959954adc',1,'cv::cudev::operator/(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04cb7fa059a6bfa8de34114ccb829475',1,'cv::cudev::operator/(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5c764c78ba7fc0170c586345d67cf82',1,'cv::cudev::operator/(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac28d28065b478079ccf4706cb328ad52',1,'cv::cudev::operator/(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8722a51ca67c9eac25f2896535e5543d',1,'cv::cudev::operator/(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd7e6744dedace2790dda951604c16f4',1,'cv::cudev::operator/(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac20d96aa5d9bc6828f580d98be9b274b',1,'cv::cudev::operator/(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e16dd1de3cc6cdaa3e01b991cf1877',1,'cv::cudev::operator/(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d2ad56cb9b7935755ab98989621744',1,'cv::cudev::operator/(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d36cf520a15e02c4639cf09d13638af',1,'cv::cudev::operator/(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae910a0177b6e5954def12c3e1ceb7889',1,'cv::cudev::operator/(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4b24fae841ff37f46b2f184e4214f49',1,'cv::cudev::operator/(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9fb15ffc426038614898e8cf6f5245',1,'cv::cudev::operator/(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad380b25d2ba11d6de6db82c39052900e',1,'cv::cudev::operator/(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b3207d6bf2685058ea4e895ac25c678',1,'cv::cudev::operator/(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15293a946d5146fd48c04f46b2b81845',1,'cv::cudev::operator/(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca80d86a8a80d0a596b3c5abdc0f5b7',1,'cv::cudev::operator/(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed6a240c984f95a345129f96274a9cfe',1,'cv::cudev::operator/(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9f5801f25493f31c7f636c3df933b99',1,'cv::cudev::operator/(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae74b42fba92a1278d5d20a37ff25668c',1,'cv::cudev::operator/(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21b3dbd89341fa3f444ea21ef6e0b2f5',1,'cv::cudev::operator/(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87509bef25c897cac8532e466e4d66a7',1,'cv::cudev::operator/(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6653c9349dcc4767667164b9c45ecc4f',1,'cv::cudev::operator/(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfbe8b6a853d911c6caa057249a2f3c2',1,'cv::cudev::operator/(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac53ae2c9994299b79543fd5d25284a85',1,'cv::cudev::operator/(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a5e479a1745b53490f2c08b0993c0e5',1,'cv::cudev::operator/(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f5210161d628f2d4e696f26fac33d7',1,'cv::cudev::operator/(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf75713de0f2b797667bb783913812cf5',1,'cv::cudev::operator/(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b57e7742e16dc732c96c86c7a25a7d',1,'cv::cudev::operator/(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53df6d0915ba0492a653459ccb61dd1e',1,'cv::cudev::operator/(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca76e1c82d8c8fa487273dd5488b5afc',1,'cv::cudev::operator/(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff3491be4e1aeb2d4b2ecfafac25bfc',1,'cv::cudev::operator/(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae20c5ffaf5dc093b018dbb2c623a4a9d',1,'cv::cudev::operator/(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga294bb78feefcf2213a99e3765bfcd590',1,'cv::cudev::operator/(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f4874876e654be2d30711f55ba67bb9',1,'cv::cudev::operator/(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931b2f3f4067c776bc79fa993f307479',1,'cv::cudev::operator/(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b00fe8b4c36cb662c4528caced6e021',1,'cv::cudev::operator/(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dd0224214d0591a4644c9fa753c613',1,'cv::cudev::operator/(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d8b0d5eb5f540043139d7077cd89acd',1,'cv::cudev::operator/(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa14eb5e414191a5110c9657940f4911f',1,'cv::cudev::operator/(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845184957965ee09b2c75d19b3c943b8',1,'cv::cudev::operator/(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98436d248883059f3789b0d0ee05623',1,'cv::cudev::operator/(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae36ded72b3f6a63e66bf8e6bedcd1246',1,'cv::cudev::operator/(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f5082bc85c86de08b2e0f479411caec',1,'cv::cudev::operator/(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d17e190d57f7cbaa40be123e2a51224',1,'cv::cudev::operator/(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41a157235e0cf757bb61bdf97c135a56',1,'cv::cudev::operator/(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5738156055f71a2394da2fd9986e73',1,'cv::cudev::operator/(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cbd3ba36dcb1399c0cebe931b575705',1,'cv::cudev::operator/(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71437398c247ffa7ef5ced05aa8c32fd',1,'cv::cudev::operator/(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca86550e3139b130209e6a73f8e288c',1,'cv::cudev::operator/(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a9725a2048b27de8e5b4b7a962b7a45',1,'cv::cudev::operator/(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga263e8628015d84cc51979ad5d9fab4dd',1,'cv::cudev::operator/(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3618b8f1c4483be2b49784692b55da93',1,'cv::cudev::operator/(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56abdc374d21db3f6d3a4750a60b46d4',1,'cv::cudev::operator/(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga964f4c517e631519f06210ca6e00a505',1,'cv::cudev::operator/(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7785eabab48b5412e4bec4c5ff9a221d',1,'cv::cudev::operator/(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga985d99669358177e1081cd19cea4fb7a',1,'cv::cudev::operator/(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ae6065edefcba07b4aab58590e4414',1,'cv::cudev::operator/(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8820b8c1e646e150d78c6c23192d99bc',1,'cv::cudev::operator/(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaad5d6d10fa57557f159b67b9618bf557',1,'operator/(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga995d0eb099efa09893b36adecda4243a',1,'operator/(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga73e22cc4b1f8a3132abc30677ed531c4',1,'operator/(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63c10edfae5414877b679eeb58c9f4a7',1,'operator/(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2abad8ee149156b1c5538b6fc541638',1,'operator/(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1a1c4ccd594dd41d946649a7ab1ca3',1,'operator/(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfba9463c82a223ac76103d9bcf16aa0',1,'operator/(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1782e839b0d1c68438dbecfcac2820ac',1,'operator/(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabaec01b86941bbff223af9d2c29e68bc',1,'operator/(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0f36028b3f87632fbadae1cf5f2d03',1,'operator/(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8314510e1d4316367ac391f110059454',1,'operator/(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9036097b144dbf93817c5ef126d116d0',1,'operator/(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8db65d14cd813f8d457b921c39bb27a8',1,'operator/(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c6b1c78bd2dbea3ea062235736e7329',1,'operator/(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d4687efb816dcbc5a403deef46acdb',1,'operator/(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3bfcae1affcdf5e57f963f93722a04c3',1,'operator/(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa73d74035bcb8e99515b0e082068845',1,'operator/(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26c9c7aac034c3c77d2c7fcafb2b7324',1,'operator/(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b20a16f030f203ca1246b182ee58fd5',1,'operator/(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89c3f0a954a006a68c412300414e17de',1,'operator/(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520991356f52a0254059d9542c16006',1,'operator/(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ef2415aa67752f6a252d4f7d068a526',1,'operator/(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68da45fdf82b957dbb2cf14a027c0322',1,'operator/(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67a4465bc93192a57e10555bccc96bda',1,'operator/(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga906b0deabff7997bb4d80ae166a137c3',1,'operator/(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a7b51f10d165feaae86cd0bc18e91e1',1,'operator/(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a6cbf801c763c54dbd07832815194bd',1,'operator/(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52e5285f48a908e86ff891aed2d743f2',1,'operator/(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a2a30fd3e15d27a99f3b7d1917f9e38',1,'operator/(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga624a50622e8a386f768ef3190ef08ba8',1,'operator/(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac63ba9fe41878226447c261efbb516c1',1,'operator/(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga436022693ffe3e23663fa33b1512e777',1,'operator/(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5877c60845ecd0eb7145b119e6513b55',1,'operator/(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ef3fffb48e92a7a50f3851c5fb7338b',1,'operator/(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad520b1c01bd7118c82548f6cb020238f',1,'operator/(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae93cb2fb69f84957b45190513bc4ac38',1,'operator/(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadff98c44d9758083f04c7eee4e7d5a3e',1,'operator/(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga549d0f141917aec8ef972c77971c1084',1,'operator/(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508053e4393ce90846ce4974907d317a',1,'operator/(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga583198460ba33f63a71a030fb51ea4ec',1,'operator/(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a8182f4c0412f05ec96d4f734619f65',1,'operator/(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae209c1b38d254292bf2ff0ca617d96bd',1,'operator/(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7ce642e9cb3aad8237b74e57545ec0',1,'operator/(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc358c56da85f1e9fb45ec4379aef819',1,'operator/(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37633241bee5b78408d690bea4d6bc97',1,'operator/(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182216df7f15de3724ac89de6dbbdc08',1,'operator/(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24d234d3496e5365fcc0181c864bee8f',1,'operator/(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84226e77b868bda78abaa855e431f83b',1,'operator/(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5065b677cee6eaf61c4990fab2fef59b',1,'operator/(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45b4e9375b6e30685cc40474d84ccf02',1,'operator/(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2025f63f3d90e41dec633bedd58357e',1,'operator/(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86d40a00cbb232d5d72ba19ec81ed438',1,'operator/(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc622e639c83e90f061aea4d908af53',1,'operator/(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8126bd6f60da8d7fcb39cb6abd253bdc',1,'operator/(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae06070c3075afe5424512508edb81586',1,'operator/(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga460f926abfd82d2b3f91e886ee6d6aa4',1,'operator/(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19e6a6945b5af142801ced01b619f993',1,'operator/(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaade20eaaba20908f19ea46982534d36f',1,'operator/(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d97c6ab31477097c28510e7b449979f',1,'operator/(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07c8153666fa828bf51ba1df3d037641',1,'operator/(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace9317803db502fe7a302c33e81fde41',1,'operator/(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04b6dbca2658111aa32e4b32f88e3d29',1,'operator/(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb7d476559b303db2472d6effecb2f89',1,'operator/(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab32e30453cfc72ff1b0aa78c8a1b2d',1,'operator/(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfda695bfc877ea25dbf96d5b554676',1,'operator/(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3addc09f491a734516e0b7dd2b44179',1,'operator/(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a4539fab45842a06a5edecc85beb00',1,'operator/(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad727324599c518090bdfccf7b8e08c22',1,'operator/(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5db301a86ed3528e1ae4d332a6f30fd2',1,'operator/(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53358badb500dfd70e070cf1ebfd0a18',1,'operator/(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56dffbd26015a50c0bc5aa6ebb742c31',1,'operator/(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac92b8e55ec04f04b2c031123d997c266',1,'operator/(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987dcefef0b62d8bc37af554235fe0ef',1,'operator/(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab67eafd771d2282a502fdbd6c54ead06',1,'operator/(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ab843a5f0b70aad934d6c3e5c5b8257',1,'operator/(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga947ed5817156d062129c8903c0603e95',1,'operator/(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5eed4cb9d49becaa49611f544539d206',1,'operator/(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05241f798415de42c5da5c69c55aef11',1,'operator/(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf24592373ca8cb6278d42bd53e8184a',1,'operator/(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99f77817f5ca8058516194a9dd63c283',1,'operator/(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed1bde145568955c9f1131d91a4e0614',1,'operator/(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cc5fea7eec39d991a9bca1c5d65f450',1,'operator/(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2564bcebc93bb19ad1ef13ad520ed4d',1,'operator/(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6829aff16fde91d0e7465d0fb6e62913',1,'operator/(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50208cff6a446a4b35ac2f8688eebce0',1,'operator/(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa97fbcd1bc2ad1f58b02b567645c9d61',1,'operator/(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga816379a4f078d68b1c4c351dad009189',1,'operator/(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabef9e42d02bba8884bfad5fbe70bbada',1,'operator/(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17a0b78772e84b3e73b6890b49d340e1',1,'operator/(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga794491c37dd2df850f3893138414353a',1,'operator/(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b08fc0b7dbd5277deb26cdc85008b2d',1,'operator/(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b04679db179bda54f1e9d0d2673ffc4',1,'operator/(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8034cd977168fcbeb64d0f143c27dd6c',1,'operator/(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad760f8b985f9f78e6f7cfae125c57952',1,'operator/(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab37aec5734a505aa76159bb43f68a636',1,'operator/(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c116242125c2ea7d6aaef804c309757',1,'operator/(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ba61529ddd1ed3f0329c56b834999a1',1,'operator/(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga113d7371aab51f681e1e5e82d268c3ee',1,'operator/(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65207a98a6ba24f91f6d735a88c4ae11',1,'operator/(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4cab124d95ea36b40f41915cb6c52e',1,'operator/(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c0325622303ec37f5a35fdb5acb4aba',1,'operator/(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51668d8071ec45f300736c84386a95de',1,'operator/(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ba06691317169f995b1e4f84af326f',1,'operator/(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cd026898af4d75be94752d39ea86285',1,'operator/(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f6d00516b5705d5b0bfe98574781f29',1,'operator/(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf2e26c94589161b5aa1ff904b3d91c1',1,'operator/(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1fd8b99c66de2ff572d583fd379f9a3',1,'operator/(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga941fdc20547d924ada48cfb0e59957c2',1,'operator/(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147f7c5b249d5eec2f5edbe9d663f023',1,'operator/(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a2f63e1448c1423a462cb3802dbc1fc',1,'operator/(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f9f5d4955d4910a88edc28d264773a',1,'operator/(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788722f37dc7eedf7369be91a27b2baf',1,'operator/(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0784968a2beace1b43d5bfcad6895bf8',1,'operator/(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4107f0212b5bd97903dbc0fd113a55bd',1,'operator/(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f7aee12ad93a7ddeb22a39e77fbb649',1,'operator/(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86164b5b800cbf1a1bc1da69dc6b1cea',1,'operator/(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffb8f750584cbf3428cca25579fa9e0e',1,'operator/(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddffd612d0a062ab2c7c63f809d32103',1,'operator/(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8efa47e085c080af09f59676bce38003',1,'operator/(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3701eb47de8686f78f358575ee69eab',1,'operator/(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4996cdd2cf5b7d7f88201b3280b9b882',1,'operator/(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efd1425a4f37f08505df7138be39786',1,'operator/(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb65bc0269df370c51277a668fcdcc73',1,'operator/(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa92a62d328a8ab3e85e80b52693d156c',1,'operator/(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72f5c3ec2dbedb3f1150559435cb430b',1,'operator/(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391153a0840528f075a6fc407e841c10',1,'operator/(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadeb192837562e5c4b8d82f8ab38bf084',1,'operator/(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2f238b633143c3e6b22b2b8579c53e',1,'operator/(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f1ef76972820abe1d3a3ae91e95de4',1,'operator/(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15fa7ad89e9bafc4993276448a0d3bd5',1,'operator/(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab15f13356b2c04e4c2c4cebdcf6e4b',1,'operator/(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafae9c481f30b10a2c900bf4a4da08af8',1,'operator/(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7ca775d4ec4865729ecdc345dab1e30',1,'operator/(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade1df8d73b8ac8fb3fd2fb853a0c187a',1,'operator/(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe8737c01957c40118140eec1bf68d9',1,'operator/(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6c52b2d2d236023ea59691301f17cc',1,'operator/(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8435aa501c96247ea59d3ea8b947117e',1,'operator/(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga828cee39fcbf51a1644d44510c12b7b4',1,'operator/(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c5f0b61d269ea3a00f58a1b80b09aa5',1,'operator/(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94a4aa6688bbf6fb5dbe16962cf49041',1,'operator/(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ac2bcd0e1c58eabcbba3caa878be93f',1,'operator/(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fccb24eadfc89075e1380c4a840226d',1,'operator/(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f329583283b38d835e5111baa0e9ccb',1,'operator/(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac224098894c2dd93c45d36ce0aa2d8f0',1,'operator/(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf34d47c8fc399c1b5633a81e0a2a20aa',1,'operator/(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64c7907250e45a962209e2c4c8e3860d',1,'operator/(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1db39b81ceb79ce30d5ff502387a0172',1,'operator/(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e6457d8d8908556e5a6623bca43f0d5',1,'operator/(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22b5c96ff38d1d48b10aabad0e49be7b',1,'operator/(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdf50d97f13cd4161262f9f7152c936c',1,'operator/(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga317fc707d6c32eb0344e606c409cd502',1,'operator/(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0dd8315bf86df24af59d7a26804f4af3',1,'operator/(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca9088b2f5335ee8214a1dfbc42fd1d',1,'operator/(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1aaea7b03c2dff6baf65f0054823b44',1,'operator/(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49c5598a8d2bcf1957abd74da1c06936',1,'operator/(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d4fa53f21d88b5d9fa07222b90ee3c',1,'operator/(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c71abb3cec3af512f67e4b7134f4870',1,'operator/(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9763eb69ace36e922bdc23adf58fa071',1,'operator/(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6426caf4d84767c4f4b4df77b4bd8f7',1,'operator/(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b4c3fadce268d79da7c2e33e1aa8ac',1,'operator/(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fda9fbfd0224f6806547e77bbc9bbec',1,'operator/(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c9e4aecc482aeae0ebd4fc37b1efd7',1,'operator/(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeffd81f4b90d5e1fb4f7d8658d595a73',1,'operator/(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae885e6e18ed764df65cc712846fbcf82',1,'operator/(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e271106bb16c64506b78f50599ffad0',1,'operator/(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2af76884f887a6bae64783d7cfa3fd5',1,'operator/(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga216608449d27058bfa3427d67089019b',1,'operator/(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85aa004a5cb3b6108b0041ad11574367',1,'operator/(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a42711792e9b1ed79c25959954adc',1,'operator/(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04cb7fa059a6bfa8de34114ccb829475',1,'operator/(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5c764c78ba7fc0170c586345d67cf82',1,'operator/(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac28d28065b478079ccf4706cb328ad52',1,'operator/(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8722a51ca67c9eac25f2896535e5543d',1,'operator/(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd7e6744dedace2790dda951604c16f4',1,'operator/(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac20d96aa5d9bc6828f580d98be9b274b',1,'operator/(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e16dd1de3cc6cdaa3e01b991cf1877',1,'operator/(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d2ad56cb9b7935755ab98989621744',1,'operator/(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d36cf520a15e02c4639cf09d13638af',1,'operator/(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae910a0177b6e5954def12c3e1ceb7889',1,'operator/(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4b24fae841ff37f46b2f184e4214f49',1,'operator/(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9fb15ffc426038614898e8cf6f5245',1,'operator/(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad380b25d2ba11d6de6db82c39052900e',1,'operator/(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b3207d6bf2685058ea4e895ac25c678',1,'operator/(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15293a946d5146fd48c04f46b2b81845',1,'operator/(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca80d86a8a80d0a596b3c5abdc0f5b7',1,'operator/(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed6a240c984f95a345129f96274a9cfe',1,'operator/(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9f5801f25493f31c7f636c3df933b99',1,'operator/(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae74b42fba92a1278d5d20a37ff25668c',1,'operator/(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21b3dbd89341fa3f444ea21ef6e0b2f5',1,'operator/(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87509bef25c897cac8532e466e4d66a7',1,'operator/(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6653c9349dcc4767667164b9c45ecc4f',1,'operator/(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfbe8b6a853d911c6caa057249a2f3c2',1,'operator/(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac53ae2c9994299b79543fd5d25284a85',1,'operator/(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a5e479a1745b53490f2c08b0993c0e5',1,'operator/(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f5210161d628f2d4e696f26fac33d7',1,'operator/(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf75713de0f2b797667bb783913812cf5',1,'operator/(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b57e7742e16dc732c96c86c7a25a7d',1,'operator/(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53df6d0915ba0492a653459ccb61dd1e',1,'operator/(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca76e1c82d8c8fa487273dd5488b5afc',1,'operator/(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff3491be4e1aeb2d4b2ecfafac25bfc',1,'operator/(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae20c5ffaf5dc093b018dbb2c623a4a9d',1,'operator/(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga294bb78feefcf2213a99e3765bfcd590',1,'operator/(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f4874876e654be2d30711f55ba67bb9',1,'operator/(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931b2f3f4067c776bc79fa993f307479',1,'operator/(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b00fe8b4c36cb662c4528caced6e021',1,'operator/(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dd0224214d0591a4644c9fa753c613',1,'operator/(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d8b0d5eb5f540043139d7077cd89acd',1,'operator/(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa14eb5e414191a5110c9657940f4911f',1,'operator/(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845184957965ee09b2c75d19b3c943b8',1,'operator/(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98436d248883059f3789b0d0ee05623',1,'operator/(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae36ded72b3f6a63e66bf8e6bedcd1246',1,'operator/(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f5082bc85c86de08b2e0f479411caec',1,'operator/(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d17e190d57f7cbaa40be123e2a51224',1,'operator/(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41a157235e0cf757bb61bdf97c135a56',1,'operator/(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5738156055f71a2394da2fd9986e73',1,'operator/(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cbd3ba36dcb1399c0cebe931b575705',1,'operator/(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71437398c247ffa7ef5ced05aa8c32fd',1,'operator/(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca86550e3139b130209e6a73f8e288c',1,'operator/(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a9725a2048b27de8e5b4b7a962b7a45',1,'operator/(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga263e8628015d84cc51979ad5d9fab4dd',1,'operator/(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3618b8f1c4483be2b49784692b55da93',1,'operator/(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56abdc374d21db3f6d3a4750a60b46d4',1,'operator/(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga964f4c517e631519f06210ca6e00a505',1,'operator/(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7785eabab48b5412e4bec4c5ff9a221d',1,'operator/(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga985d99669358177e1081cd19cea4fb7a',1,'operator/(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ae6065edefcba07b4aab58590e4414',1,'operator/(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8820b8c1e646e150d78c6c23192d99bc',1,'operator/(const double2 &a, double s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga799ec0a9990b63bb54278d14b70b2d83',1,'std::operator/(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gace8f383fa21a65396e93711d963de127',1,'std::operator/(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9e32bc55ff4c92d724b1398241026af5',1,'std::operator/(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga799ec0a9990b63bb54278d14b70b2d83',1,'operator/(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gace8f383fa21a65396e93711d963de127',1,'operator/(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9e32bc55ff4c92d724b1398241026af5',1,'operator/(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)']]], - ['operator_2f_3d_117',['operator/=',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga0ee49b20d55c5902617e381807acb5bf',1,'cv::softdouble::operator/=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga93ae91dcfb3a27c7663a73aca75fd206',1,'cv::softfloat::operator/=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae2defbd37472f207493ea6b8a441899a',1,'std::complex::operator/=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga97944829154f734dd4b9df00a2e2820d',1,'std::complex::operator/=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4a86ee20d770ceb9779e865968faa6a7',1,'std::gslice_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2ea239d6f6f027caa976efe4821944d0',1,'std::indirect_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac1417dfc58271e6730675e151cd3dd06',1,'std::mask_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaea8c21a277b5dfee1f7f4b09c556259d',1,'std::slice_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15f95c715e3a16e30ff24477ccf4e502',1,'std::valarray::operator/=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4572c21b07ac304ac9d7062d2f5ae160',1,'std::valarray::operator/=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15f95c715e3a16e30ff24477ccf4e502',1,'valarray< size_t >::operator/=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4572c21b07ac304ac9d7062d2f5ae160',1,'valarray< size_t >::operator/=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a1717e11dfe9341e9cfba13140cedddce',1,'Eigen::ArrayBase::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a1717e11dfe9341e9cfba13140cedddce',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#af1b9165f5ab6b57a8305c0dc359adf7c',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'Eigen::VectorwiseOp::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Derived, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Derived, Vertical >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator/=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a7395bd0af29ac23fd3f21543c935cdfa.html#a7395bd0af29ac23fd3f21543c935cdfa',1,'nlohmann::json_pointer::operator/=(const json_pointer &ptr)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a7de51480324eb1c5a89ed552cd699875.html#a7de51480324eb1c5a89ed552cd699875',1,'nlohmann::json_pointer::operator/=(std::size_t array_idx)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_abdd21567b2b1d69329af0f520335e68b.html#abdd21567b2b1d69329af0f520335e68b',1,'nlohmann::json_pointer::operator/=(std::string token)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga310bc17ff9e6db416c9c633bb61ee868',1,'cv::operator/=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga93ae91dcfb3a27c7663a73aca75fd206',1,'operator/=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga0ee49b20d55c5902617e381807acb5bf',1,'operator/=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga310bc17ff9e6db416c9c633bb61ee868',1,'operator/=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae2defbd37472f207493ea6b8a441899a',1,'operator/=(const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga97944829154f734dd4b9df00a2e2820d',1,'operator/=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4a86ee20d770ceb9779e865968faa6a7',1,'operator/=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15f95c715e3a16e30ff24477ccf4e502',1,'operator/=(const _Tp &)(Global Namespace)']]], - ['operator_3c_118',['operator<',['https://docs.opencv.org/4.2.0/df/da3/structcv_1_1linemod_1_1QuantizedPyramid_1_1Candidate.html#aa07e4d047df342b0f27b19d1827714f5',1,'cv::linemod::QuantizedPyramid::Candidate::operator<()'],['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#a61ebd9532acb52577d28c0dfefbcb660',1,'cv::DMatch::operator<()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ada726685b67ed5fa4432cc30fb854d34',1,'cv::FileNodeIterator::operator<(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ada726685b67ed5fa4432cc30fb854d34',1,'cv::FileNodeIterator::operator<(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html#ae9655069c8161475dd6c1ff504a6c89f',1,'cv::detail::GraphEdge::operator<()'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a1a987ff8d8b29707c7562206e678a4e8',1,'cv::linemod::Match::operator<()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga479ccee369fff799ced2c404cec35be7',1,'cv::stereo::Match::operator<()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8dbe9fe15d257dbb1a566dd5b752b718',1,'cv::MatExpr::operator<(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a200c6a55801095458ffba28d0bc2051f',1,'cv::MatExpr::operator<(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a027193236c695aef28e54acf23cad5ca',1,'cv::MatExpr::operator<(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac8bc126f547c720e5ec31ce26b31f6bd',1,'cv::MatExpr::operator<(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac30c6355f02755419479b1ffaadd5728',1,'cv::MatExpr::operator<(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8dbe9fe15d257dbb1a566dd5b752b718',1,'cv::MatExpr::operator<(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a200c6a55801095458ffba28d0bc2051f',1,'cv::MatExpr::operator<(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a027193236c695aef28e54acf23cad5ca',1,'cv::MatExpr::operator<(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac8bc126f547c720e5ec31ce26b31f6bd',1,'cv::MatExpr::operator<(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac30c6355f02755419479b1ffaadd5728',1,'cv::MatExpr::operator<(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4124a96f9c9f5f9ebdee548914bf7a04',1,'cv::softdouble::operator<()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga86f3dce677d4a2fb357774c872647522',1,'cv::softfloat::operator<()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga0e974552b8acc15ea6043ec9cb3a2f44',1,'cv::operator<()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga009cbdc2c91163c286b62fd0bda874c4',1,'cv::cudev::operator<(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga720988e66770098270dbf4cba3d0a570',1,'cv::cudev::operator<(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2de2ba6d33f0f4fcdce970163f47fdb',1,'cv::cudev::operator<(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1001ed9d71e36d2d05c7c0226e4b811e',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4360f50f4aa43506746b04131967e37f',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9233091fdc2614e17dc56697f473ffd',1,'cv::cudev::operator<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0fef7f08d2f37ea7d3e7e59dd68eb1',1,'cv::cudev::operator<(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16563b7c88d735d3b93688d49ecca618',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3351ed0be9b2d6c0f30e9fc13ff0c8f2',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3232fcf3bcad7b1bb9e25bc4dc8e8860',1,'cv::cudev::operator<(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8035e6b052b86212b9290f045b49880',1,'cv::cudev::operator<(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0c410fca36f863f7630eb9688527',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa6f80ff4bc920f6653de63d42ed7e4',1,'cv::cudev::operator<(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac87884be3df070c671185a3c337298f5',1,'cv::cudev::operator<(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14bd8d044c4a278d4ba11588f5de7e2',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d75de24d1d9fbceb70565ca0341945',1,'cv::cudev::operator<(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa80300a972f7a420a010418c5deba9ca',1,'cv::cudev::operator<(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2d5efdf0de121487a6c531f99a6aaef',1,'cv::cudev::operator<(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79ac15ae7290ba39734d1aa37b1f072d',1,'cv::cudev::operator<(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2876596449fc6df9b470e3fe7252b0b',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4622e8f2d5fe5c36196f75bf8007b65',1,'cv::cudev::operator<(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9caf802fa8a65f71f42c8dffa60b318e',1,'cv::cudev::operator<(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dcde070edfa0b5575ce1b3ef503a779',1,'cv::cudev::operator<(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4162b25914b86079cf6b5c53a0bf92',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1e0f762ec13a9e0696855d2e83c692',1,'cv::cudev::operator<(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbe24952f097c0d9c6c9a669c9cbc130',1,'cv::cudev::operator<(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d26c2d02ce10ebfb67caca78e3263c2',1,'cv::cudev::operator<(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9f48d27e0dee369fa39239649ff948a',1,'cv::cudev::operator<(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eaf9aa54d8f3da1be1ab7593bc2918d',1,'cv::cudev::operator<(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1984dfdc91c77e0b2c7e3b0a549964d0',1,'cv::cudev::operator<(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee672427c981240174bb011adf7eb2e8',1,'cv::cudev::operator<(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3197e6bd63fe3b34fa21cf628ab4b2',1,'cv::cudev::operator<(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa031b73d86c8be33e09376abc5865c0b',1,'cv::cudev::operator<(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8f7518c0f408bc6b3940a887bd66d98',1,'cv::cudev::operator<(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034332a898ca12ab5055dcf56d144bab',1,'cv::cudev::operator<(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29838c4abfedff62af6e26f3d62f1da3',1,'cv::cudev::operator<(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9955935230b18c47941eb13d110520',1,'cv::cudev::operator<(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf000ab97193855a862d9374ca0413322',1,'cv::cudev::operator<(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82e21f74ab115cb8d8b130ea0aa38de1',1,'cv::cudev::operator<(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29dfd373e87547b2189a785bdd2d2d30',1,'cv::cudev::operator<(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e3ceeaa992b5389d70a970e723ebcb6',1,'cv::cudev::operator<(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47537c956d1de80e0957697c5cfc5807',1,'cv::cudev::operator<(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1be1cc49d4cecd7a5429de37a81150',1,'cv::cudev::operator<(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27ccf7cfaefc9b9bb196d6134d514954',1,'cv::cudev::operator<(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a7cbda5c7b76068d44b423ba3180197',1,'cv::cudev::operator<(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8c2178181fbb679c4b0a9917b037d6',1,'cv::cudev::operator<(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5302aa2958867fbe5d6103d02587c42',1,'cv::cudev::operator<(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5c4b2c41ed0b03aa208217b10ecd153',1,'cv::cudev::operator<(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga273e57446ed81c0483ba887dd3f93acd',1,'cv::cudev::operator<(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga954fbd581d81f4a0f22937b67cf4bd1a',1,'cv::cudev::operator<(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f78c5aa99e7921f2acb3369662ea8',1,'cv::cudev::operator<(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99b41f158893fb62ff2ec68aa59e1fe8',1,'cv::cudev::operator<(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ba0f960fc417bb64c06b91985160306',1,'cv::cudev::operator<(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0fea95e1138b1be0462bfd06d39e21',1,'cv::cudev::operator<(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac69d2269b390083983094fc05522d3e4',1,'cv::cudev::operator<(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga502b1092946623165164f1eb3db5ec13',1,'cv::cudev::operator<(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacbd2df713f63e213f3c935942f8b789d',1,'cv::cudev::operator<(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cd8a0ab74fe1776ba27691cb9dc0bb1',1,'cv::cudev::operator<(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0dfcd65770b6f6f97c624b03b456219',1,'cv::cudev::operator<(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1c5fb881e5d825b65978c18468c2aa',1,'cv::cudev::operator<(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a482c5969940a7c6039aaaa365f1bc2',1,'cv::cudev::operator<(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc2b224af30927d91ccc96465940505',1,'cv::cudev::operator<(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e887a468977d874479b527d09649134',1,'cv::cudev::operator<(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9ee2e0ba4e219c9fd9f181a7a7e7829',1,'cv::cudev::operator<(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace7961c4f78672879296988127017dc7',1,'cv::cudev::operator<(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb96b9fa9eb4cfd5063728a52752c92',1,'cv::cudev::operator<(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20019500f5925231a8e453e066061b56',1,'cv::cudev::operator<(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef934652424e05dd36af802f8f463631',1,'cv::cudev::operator<(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fd192ad18d856a0df0189ac2df19e42',1,'cv::cudev::operator<(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395ea80af7d2745dab132bbdaa9d3894',1,'cv::cudev::operator<(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76bda195f33e2574a6c60450460c5e14',1,'cv::cudev::operator<(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07693623464c75318cf0dc62902993c9',1,'cv::cudev::operator<(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b93fe9997af973d95ce09182e6f83cd',1,'cv::cudev::operator<(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56a8ddd35f97a00f47f1c58174be300d',1,'cv::cudev::operator<(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd969c3c0fae8b79b41eb91e215a0f6c',1,'cv::cudev::operator<(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae23831834eef58d15594a6de775cb097',1,'cv::cudev::operator<(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae335ff1785c5c99e207d81955d320243',1,'cv::cudev::operator<(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587f8bd580b1cbf02d82319eee32cac9',1,'cv::cudev::operator<(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e02a23a9900338a83321e93d6cb849',1,'cv::cudev::operator<(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga123f05595c78e1eb9c5ae4af2df3fedf',1,'cv::cudev::operator<(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b933d7e73b54df55090a05d233e76ed',1,'cv::cudev::operator<(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab81a6520e9c56086d5938319b47f5ee4',1,'cv::cudev::operator<(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52733db0ac977cc46e56471cb549a6f4',1,'cv::cudev::operator<(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24c3d47e3e73e50e6a7c94175a0779a2',1,'cv::cudev::operator<(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga972d5282ac2202923f870ea8bb918140',1,'cv::cudev::operator<(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e4eca8de66ce6c3006c8c83dca5b83e',1,'cv::cudev::operator<(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd9e7ebda1d8aad9ca5b6dca517b019e',1,'cv::cudev::operator<(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf952eaa3fb132711c2f6ba89ebdd98b7',1,'cv::cudev::operator<(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga098db186cca858509dc51d532b5d7564',1,'cv::cudev::operator<(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a1be5b2b49f5e029ec733450ce10fbd',1,'cv::cudev::operator<(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga579e4cccc35c306c9bed75e01586aa9d',1,'cv::cudev::operator<(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfff9bd4dde1a4bb8e90b7c15e3a3bc1',1,'cv::cudev::operator<(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdd8113fc7213a912edfcb42071db45',1,'cv::cudev::operator<(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b13aeb71dbcf00af868786d733cb6b8',1,'cv::cudev::operator<(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga364d06fad2cedd8ea6ead77708f6872a',1,'cv::cudev::operator<(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf19430d38270527b027e367dd8f75374',1,'cv::cudev::operator<(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48f6f225dc0f298b4550e3bee2922237',1,'cv::cudev::operator<(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e9cb1782ba4f252f4bf7faa67e37a9f',1,'cv::cudev::operator<(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94129d6207f24868de8cb10ea14e103',1,'cv::cudev::operator<(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bcaa50d0526305b450eb7388e30e79',1,'cv::cudev::operator<(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41ad1e69567d7b71a7e5d251f5105b9',1,'cv::cudev::operator<(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47873f124d86cc20cc38b12aad2822a7',1,'cv::cudev::operator<(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a12a1d99cffc29b3a5d722a3bc24eb',1,'cv::cudev::operator<(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa774569fab758f87ea2f32da59541701',1,'cv::cudev::operator<(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e852a418f5730b03e7b2cee91cf78f5',1,'cv::cudev::operator<(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bc4c0b02d2261a0a8f073ea42012509',1,'cv::cudev::operator<(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac42d55945bb2f549eac6b422d70134e9',1,'cv::cudev::operator<(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b8bf0a9ddf12f5978fa840bbb1281c1',1,'cv::cudev::operator<(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe6f82b9b2d38747c4d07bdd384d344',1,'cv::cudev::operator<(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05d714d19bf702199d8bd7e008d8549c',1,'cv::cudev::operator<(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54d0a4a5dc2a8b97726c52d724cd7de4',1,'cv::cudev::operator<(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9d3a1bb44b76d738543a582e2178ebb',1,'cv::cudev::operator<(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3355798174802823946fd7d843d11e6e',1,'cv::cudev::operator<(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572769430e10effec5056d6df7efa16c',1,'cv::cudev::operator<(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ad33b110711b4827718cfef458d5ed7',1,'cv::cudev::operator<(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac72dfaedbb3a827ed78228af321574a1',1,'cv::cudev::operator<(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75730e1d5cede97eb4faf4f1bd833227',1,'cv::cudev::operator<(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e43019fba0109832ea5b5f74e1e92ff',1,'cv::cudev::operator<(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac46443ae5909e3a5066c06f208610caf',1,'cv::cudev::operator<(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae85889915d683c12e077cb4ec5083c2e',1,'cv::cudev::operator<(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga86f3dce677d4a2fb357774c872647522',1,'operator<(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4124a96f9c9f5f9ebdee548914bf7a04',1,'operator<(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga0e974552b8acc15ea6043ec9cb3a2f44',1,'operator<(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga009cbdc2c91163c286b62fd0bda874c4',1,'operator<(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga720988e66770098270dbf4cba3d0a570',1,'operator<(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2de2ba6d33f0f4fcdce970163f47fdb',1,'operator<(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1001ed9d71e36d2d05c7c0226e4b811e',1,'operator<(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4360f50f4aa43506746b04131967e37f',1,'operator<(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9233091fdc2614e17dc56697f473ffd',1,'operator<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0fef7f08d2f37ea7d3e7e59dd68eb1',1,'operator<(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16563b7c88d735d3b93688d49ecca618',1,'operator<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3351ed0be9b2d6c0f30e9fc13ff0c8f2',1,'operator<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3232fcf3bcad7b1bb9e25bc4dc8e8860',1,'operator<(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8035e6b052b86212b9290f045b49880',1,'operator<(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0c410fca36f863f7630eb9688527',1,'operator<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa6f80ff4bc920f6653de63d42ed7e4',1,'operator<(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac87884be3df070c671185a3c337298f5',1,'operator<(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14bd8d044c4a278d4ba11588f5de7e2',1,'operator<(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d75de24d1d9fbceb70565ca0341945',1,'operator<(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa80300a972f7a420a010418c5deba9ca',1,'operator<(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2d5efdf0de121487a6c531f99a6aaef',1,'operator<(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79ac15ae7290ba39734d1aa37b1f072d',1,'operator<(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2876596449fc6df9b470e3fe7252b0b',1,'operator<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4622e8f2d5fe5c36196f75bf8007b65',1,'operator<(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9caf802fa8a65f71f42c8dffa60b318e',1,'operator<(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dcde070edfa0b5575ce1b3ef503a779',1,'operator<(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4162b25914b86079cf6b5c53a0bf92',1,'operator<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1e0f762ec13a9e0696855d2e83c692',1,'operator<(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbe24952f097c0d9c6c9a669c9cbc130',1,'operator<(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d26c2d02ce10ebfb67caca78e3263c2',1,'operator<(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9f48d27e0dee369fa39239649ff948a',1,'operator<(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eaf9aa54d8f3da1be1ab7593bc2918d',1,'operator<(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1984dfdc91c77e0b2c7e3b0a549964d0',1,'operator<(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee672427c981240174bb011adf7eb2e8',1,'operator<(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3197e6bd63fe3b34fa21cf628ab4b2',1,'operator<(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa031b73d86c8be33e09376abc5865c0b',1,'operator<(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8f7518c0f408bc6b3940a887bd66d98',1,'operator<(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034332a898ca12ab5055dcf56d144bab',1,'operator<(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29838c4abfedff62af6e26f3d62f1da3',1,'operator<(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9955935230b18c47941eb13d110520',1,'operator<(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf000ab97193855a862d9374ca0413322',1,'operator<(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82e21f74ab115cb8d8b130ea0aa38de1',1,'operator<(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29dfd373e87547b2189a785bdd2d2d30',1,'operator<(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e3ceeaa992b5389d70a970e723ebcb6',1,'operator<(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47537c956d1de80e0957697c5cfc5807',1,'operator<(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1be1cc49d4cecd7a5429de37a81150',1,'operator<(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27ccf7cfaefc9b9bb196d6134d514954',1,'operator<(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a7cbda5c7b76068d44b423ba3180197',1,'operator<(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8c2178181fbb679c4b0a9917b037d6',1,'operator<(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5302aa2958867fbe5d6103d02587c42',1,'operator<(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5c4b2c41ed0b03aa208217b10ecd153',1,'operator<(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga273e57446ed81c0483ba887dd3f93acd',1,'operator<(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga954fbd581d81f4a0f22937b67cf4bd1a',1,'operator<(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f78c5aa99e7921f2acb3369662ea8',1,'operator<(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99b41f158893fb62ff2ec68aa59e1fe8',1,'operator<(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ba0f960fc417bb64c06b91985160306',1,'operator<(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0fea95e1138b1be0462bfd06d39e21',1,'operator<(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac69d2269b390083983094fc05522d3e4',1,'operator<(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga502b1092946623165164f1eb3db5ec13',1,'operator<(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacbd2df713f63e213f3c935942f8b789d',1,'operator<(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cd8a0ab74fe1776ba27691cb9dc0bb1',1,'operator<(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0dfcd65770b6f6f97c624b03b456219',1,'operator<(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1c5fb881e5d825b65978c18468c2aa',1,'operator<(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a482c5969940a7c6039aaaa365f1bc2',1,'operator<(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc2b224af30927d91ccc96465940505',1,'operator<(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e887a468977d874479b527d09649134',1,'operator<(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9ee2e0ba4e219c9fd9f181a7a7e7829',1,'operator<(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace7961c4f78672879296988127017dc7',1,'operator<(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb96b9fa9eb4cfd5063728a52752c92',1,'operator<(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20019500f5925231a8e453e066061b56',1,'operator<(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef934652424e05dd36af802f8f463631',1,'operator<(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fd192ad18d856a0df0189ac2df19e42',1,'operator<(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395ea80af7d2745dab132bbdaa9d3894',1,'operator<(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76bda195f33e2574a6c60450460c5e14',1,'operator<(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07693623464c75318cf0dc62902993c9',1,'operator<(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b93fe9997af973d95ce09182e6f83cd',1,'operator<(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56a8ddd35f97a00f47f1c58174be300d',1,'operator<(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd969c3c0fae8b79b41eb91e215a0f6c',1,'operator<(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae23831834eef58d15594a6de775cb097',1,'operator<(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae335ff1785c5c99e207d81955d320243',1,'operator<(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587f8bd580b1cbf02d82319eee32cac9',1,'operator<(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e02a23a9900338a83321e93d6cb849',1,'operator<(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga123f05595c78e1eb9c5ae4af2df3fedf',1,'operator<(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b933d7e73b54df55090a05d233e76ed',1,'operator<(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab81a6520e9c56086d5938319b47f5ee4',1,'operator<(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52733db0ac977cc46e56471cb549a6f4',1,'operator<(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24c3d47e3e73e50e6a7c94175a0779a2',1,'operator<(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga972d5282ac2202923f870ea8bb918140',1,'operator<(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e4eca8de66ce6c3006c8c83dca5b83e',1,'operator<(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd9e7ebda1d8aad9ca5b6dca517b019e',1,'operator<(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf952eaa3fb132711c2f6ba89ebdd98b7',1,'operator<(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga098db186cca858509dc51d532b5d7564',1,'operator<(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a1be5b2b49f5e029ec733450ce10fbd',1,'operator<(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga579e4cccc35c306c9bed75e01586aa9d',1,'operator<(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfff9bd4dde1a4bb8e90b7c15e3a3bc1',1,'operator<(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdd8113fc7213a912edfcb42071db45',1,'operator<(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b13aeb71dbcf00af868786d733cb6b8',1,'operator<(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga364d06fad2cedd8ea6ead77708f6872a',1,'operator<(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf19430d38270527b027e367dd8f75374',1,'operator<(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48f6f225dc0f298b4550e3bee2922237',1,'operator<(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e9cb1782ba4f252f4bf7faa67e37a9f',1,'operator<(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94129d6207f24868de8cb10ea14e103',1,'operator<(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bcaa50d0526305b450eb7388e30e79',1,'operator<(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41ad1e69567d7b71a7e5d251f5105b9',1,'operator<(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47873f124d86cc20cc38b12aad2822a7',1,'operator<(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a12a1d99cffc29b3a5d722a3bc24eb',1,'operator<(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa774569fab758f87ea2f32da59541701',1,'operator<(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e852a418f5730b03e7b2cee91cf78f5',1,'operator<(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bc4c0b02d2261a0a8f073ea42012509',1,'operator<(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac42d55945bb2f549eac6b422d70134e9',1,'operator<(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b8bf0a9ddf12f5978fa840bbb1281c1',1,'operator<(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe6f82b9b2d38747c4d07bdd384d344',1,'operator<(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05d714d19bf702199d8bd7e008d8549c',1,'operator<(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54d0a4a5dc2a8b97726c52d724cd7de4',1,'operator<(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9d3a1bb44b76d738543a582e2178ebb',1,'operator<(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3355798174802823946fd7d843d11e6e',1,'operator<(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572769430e10effec5056d6df7efa16c',1,'operator<(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ad33b110711b4827718cfef458d5ed7',1,'operator<(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac72dfaedbb3a827ed78228af321574a1',1,'operator<(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75730e1d5cede97eb4faf4f1bd833227',1,'operator<(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e43019fba0109832ea5b5f74e1e92ff',1,'operator<(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac46443ae5909e3a5066c06f208610caf',1,'operator<(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae85889915d683c12e077cb4ec5083c2e',1,'operator<(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga479ccee369fff799ced2c404cec35be7',1,'operator<(const Match &rhs) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a322f7449964a51cfe95142e14db0ef72',1,'__gnu_cxx::operator<(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ad7d9e389800dcea7b1748d08f70f0358',1,'__gnu_cxx::operator<(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#afdc865f8e1dd5fb8be54c6a608d6ca17',1,'__gnu_cxx::operator<(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53d215eee36632ee43c5039c54d648ae',1,'std::operator<(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7d32b48a9dc0ee1316aedbde00a1a8fd',1,'std::operator<(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga69e152dbea8e3ca77b307634084fb164',1,'std::operator<(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a203ef17a8b706e78acfa3d05f30e20ca',1,'std::operator<(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7f56f6da4d4f20444cbbab54a95e99e5',1,'std::operator<(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gad9079e03d834c2dfd61dfae4f73f0031',1,'std::operator<(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga341b35e5b4af405e08d5c2abb676cf39',1,'std::operator<(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a64f0c6157f108a5bfe4ac5096e5bc4b2',1,'std::operator<(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20182f0fe24d991ad8a8daede16933fa',1,'std::operator<(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga11e1ee39f1b05e646abe2caea0565967',1,'std::operator<(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga01622c3d750044cf92cd8a1eaa89ca5b',1,'std::operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1862d7e70ac15663db23831edbc4d06f',1,'std::operator<(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5e86344cdca451bac42e9d9936e99353',1,'std::operator<(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a3cbf6143f4ce61b7174408e06a4181f0',1,'std::operator<(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gabc00ef86c05a9226d2007dd587c196f3',1,'std::operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8fcefae1f44d9e5656f2231d04742454',1,'std::operator<(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7b31ae4487ff01fcb215071c0f521caa',1,'std::operator<(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a15c710c3bf507d1a7bdf5f8de40cafe2',1,'std::operator<(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa0eb871a6a5db29c6fa9c682b7808bdd',1,'std::operator<(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a27a4470c800ce13f6c1220c5ec11c360',1,'std::operator<(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5a6f7a1317ae28e6f2b71a0497873e25',1,'std::operator<(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gad9079e03d834c2dfd61dfae4f73f0031',1,'operator<(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga341b35e5b4af405e08d5c2abb676cf39',1,'operator<(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20182f0fe24d991ad8a8daede16933fa',1,'operator<(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga11e1ee39f1b05e646abe2caea0565967',1,'operator<(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga01622c3d750044cf92cd8a1eaa89ca5b',1,'operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1862d7e70ac15663db23831edbc4d06f',1,'operator<(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gabc00ef86c05a9226d2007dd587c196f3',1,'operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga69e152dbea8e3ca77b307634084fb164',1,'operator<(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], - ['operator_3c_3c_119',['operator<<',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a5d64e1a22e8e659de99a027f66bf26bc',1,'cv::FileStorage::operator<<(FileStorage &fs, const String &str)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a84431fd1b5075275f5c3407dc58b36ae',1,'cv::FileStorage::operator<<(FileStorage &fs, const _Tp &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#acdfed1145ad6cc92e20975596c7b8bed',1,'cv::FileStorage::operator<<(FileStorage &fs, const char *str)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae1a501b3d13d8fd3de1b7299926a02cd',1,'cv::FileStorage::operator<<(FileStorage &fs, char *value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a84431fd1b5075275f5c3407dc58b36ae',1,'cv::FileStorage::operator<<(FileStorage &fs, const _Tp &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#acdfed1145ad6cc92e20975596c7b8bed',1,'cv::FileStorage::operator<<(FileStorage &fs, const char *str)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae1a501b3d13d8fd3de1b7299926a02cd',1,'cv::FileStorage::operator<<(FileStorage &fs, char *value)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a674a3009537b05a655ad483acd8e09eb',1,'cv::VideoWriter::operator<<(const Mat &image)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#ad9a866bd422a46216993e8015f8f68cf',1,'cv::VideoWriter::operator<<(const UMat &image)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'basic_iostream< char >::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'basic_iostream< char >::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_iostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_iostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_iostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_iostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_iostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_iostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_iostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_iostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_iostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_iostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_iostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_iostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_iostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_iostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_iostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_iostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_iostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_iostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_iostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_iostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_iostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_iostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_iostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_iostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_iostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_iostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_iostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_iostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_iostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_iostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'basic_ostream< char >::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'basic_ostream< char >::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'basic_ostream< char, _Traits >::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'basic_ostream< char, _Traits >::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char, _Traits >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char, _Traits >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char, _Traits >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char, _Traits >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char, _Traits >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char, _Traits >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char, _Traits >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char, _Traits >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char, _Traits >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char, _Traits >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char, _Traits >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char, _Traits >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char, _Traits >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char, _Traits >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char, _Traits >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char, _Traits >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char, _Traits >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char, _Traits >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char, _Traits >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char, _Traits >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char, _Traits >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char, _Traits >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char, _Traits >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char, _Traits >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char, _Traits >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char, _Traits >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char, _Traits >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char, _Traits >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char, _Traits >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char, _Traits >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_fstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_fstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_fstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_fstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_fstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_fstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_fstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_fstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_fstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_fstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_fstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_fstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_fstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_fstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_fstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_fstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_fstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_fstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_fstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_fstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_fstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_fstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_fstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_fstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_fstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_fstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_fstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_fstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_fstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_fstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_fstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_fstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_iostream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_iostream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_iostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_iostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_iostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_iostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_iostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_iostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_iostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_iostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_iostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_iostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_iostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_iostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_iostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_iostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_iostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_iostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_iostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_iostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_iostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_iostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_iostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_iostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_iostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_iostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_iostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_iostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_iostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_iostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_iostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_iostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_ofstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_ofstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ofstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ofstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ofstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ofstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ofstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ofstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ofstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ofstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ofstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ofstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ofstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ofstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ofstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ofstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ofstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ofstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ofstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ofstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ofstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ofstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ofstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ofstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ofstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ofstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ofstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ofstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ofstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ofstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ofstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ofstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_ostream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_ostream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_ostringstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_ostringstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_stringstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_stringstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_stringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_stringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_stringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_stringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_stringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_stringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_stringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_stringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_stringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_stringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_stringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_stringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_stringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_stringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_stringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_stringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_stringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_stringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_stringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_stringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_stringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_stringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_stringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_stringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_stringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_stringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_stringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_stringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_stringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_stringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a725f2ea3af449e1e3286300e694d863d',1,'std::bitset::operator<<(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a725f2ea3af449e1e3286300e694d863d',1,'std::bitset::operator<<(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a436906ba9f65924c521aba3f4c981616',1,'std::tr2::dynamic_bitset::operator<<(size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a436906ba9f65924c521aba3f4c981616',1,'std::tr2::dynamic_bitset::operator<<(size_type __pos) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'Eigen::DenseBase::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'Eigen::DenseBase::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'Eigen::DenseBase::operator<<(std::ostream &s, const DenseBase< Derived > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator<<(std::ostream &s, const DenseBase< ArrayWrapper< ExpressionType > > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator<<(std::ostream &s, const DenseBase< Homogeneous< MatrixType, _Direction > > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'DenseBase< Solve< Decomposition, RhsType > >::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'DenseBase< Solve< Decomposition, RhsType > >::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'DenseBase< Solve< Decomposition, RhsType > >::operator<<(std::ostream &s, const DenseBase< Solve< Decomposition, RhsType > > &m)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#abadf4e6fb19d70207d8e5600747b8c2c',1,'cv::operator<<(std::ostream &os, const GMetaArg &)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a83a3132a9b08145ceb61a56eb1abcd11',1,'cv::operator<<(std::ostream &os, const cv::GArrayDesc &desc)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a0c9fa53616ecd94efd7e9359dd439cb0',1,'cv::operator<<(std::ostream &os, const cv::GScalarDesc &desc)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#aa078055dbff233794a73da855cdd1288',1,'cv::operator<<(std::ostream &os, const cv::GMatDesc &desc)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5cdb7018d77509d22194d74f8e066f4c',1,'cv::operator<<(std::ostream &out, const TickMeter &tm)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacef821c50106276406bf4bc1cd7a059a',1,'cv::operator<<(const v_reg< _Tp, n > &a, int imm)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf47f069bbc73929ec5fd73ce9947339a',1,'cv::operator<<(String &out, Ptr< Formatted > fmtd)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3557054d1f0f079cf5e60a44851e4c70',1,'cv::operator<<(String &out, const Mat &mtx)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89d6a7eb3b4253c351bdd5c87bd6e15c',1,'cv::cudev::operator<<(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac309e654bf56a92bce54257f60224978',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37724ee1b2714aa21d8333bdd0b60332',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d89446b9cd1b84d4c54b3626ea797dd',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23de5acc1ec45d07a00fe8f37f7f2702',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2526c7f52b4492a5c8f41c30b2f21de',1,'cv::cudev::operator<<(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdab9d7d458a6819636e2031176dbf19',1,'cv::cudev::operator<<(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf98ccc0340ec81f52ec4c4079978a10a',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fbe62deadc03136397368ef9858f6f7',1,'cv::cudev::operator<<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf970863271a297e3197d7f9d1c6fba2c',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5141661e7abfe6f695104cd2f80199cc',1,'cv::cudev::operator<<(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa02b5451a03bbfe3fb34a0997e2c337f',1,'cv::cudev::operator<<(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca5eab3b992fbcf25f4089bd19ba2d80',1,'cv::cudev::operator<<(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e6980cc8c55e7d4d2a6b543d5ea145d',1,'cv::cudev::operator<<(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6a5b89d72294aa4f962767ee2fc0537',1,'cv::cudev::operator<<(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5184147f1ae14d34ebe791b02bb23617',1,'cv::cudev::operator<<(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac84a8246095fdb1ee004cff3802ab4e0',1,'cv::cudev::operator<<(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83575e7f013d7c113a991948c4b65314',1,'cv::cudev::operator<<(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga342190a6ce5ef956b5b54a8f9b2c7317',1,'cv::cudev::operator<<(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32b6410f888d77e0bd160d6fe83824',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e299bf0650ac5d0f894ac165109e219',1,'cv::cudev::operator<<(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b494e6b58845e60c37350325d48268',1,'cv::cudev::operator<<(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f12be0b00cb28aa3a721b8dc96c9bc',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga519fefe984648ac2ccb3778d3ed0b48b',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a848acecc1b2682cf97f8da363569e24f',1,'cv::dnn::operator<<()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a41e9a5ded43842da10ea7875e9d9a1aa',1,'cv::gapi::own::operator<<(std::ostream &o, const Rect &rect)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ad54ba083ef5d8b00875c97b457341dc9',1,'cv::gapi::own::operator<<(std::ostream &o, const Size &s)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf47f069bbc73929ec5fd73ce9947339a',1,'operator<<(String &out, Ptr< Formatted > fmtd)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3557054d1f0f079cf5e60a44851e4c70',1,'operator<<(String &out, const Mat &mtx)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5cdb7018d77509d22194d74f8e066f4c',1,'operator<<(std::ostream &out, const TickMeter &tm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacef821c50106276406bf4bc1cd7a059a',1,'operator<<(const v_reg< _Tp, n > &a, int imm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89d6a7eb3b4253c351bdd5c87bd6e15c',1,'operator<<(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac309e654bf56a92bce54257f60224978',1,'operator<<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37724ee1b2714aa21d8333bdd0b60332',1,'operator<<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d89446b9cd1b84d4c54b3626ea797dd',1,'operator<<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23de5acc1ec45d07a00fe8f37f7f2702',1,'operator<<(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2526c7f52b4492a5c8f41c30b2f21de',1,'operator<<(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdab9d7d458a6819636e2031176dbf19',1,'operator<<(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf98ccc0340ec81f52ec4c4079978a10a',1,'operator<<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fbe62deadc03136397368ef9858f6f7',1,'operator<<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf970863271a297e3197d7f9d1c6fba2c',1,'operator<<(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5141661e7abfe6f695104cd2f80199cc',1,'operator<<(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa02b5451a03bbfe3fb34a0997e2c337f',1,'operator<<(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca5eab3b992fbcf25f4089bd19ba2d80',1,'operator<<(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e6980cc8c55e7d4d2a6b543d5ea145d',1,'operator<<(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6a5b89d72294aa4f962767ee2fc0537',1,'operator<<(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5184147f1ae14d34ebe791b02bb23617',1,'operator<<(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac84a8246095fdb1ee004cff3802ab4e0',1,'operator<<(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83575e7f013d7c113a991948c4b65314',1,'operator<<(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga342190a6ce5ef956b5b54a8f9b2c7317',1,'operator<<(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32b6410f888d77e0bd160d6fe83824',1,'operator<<(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e299bf0650ac5d0f894ac165109e219',1,'operator<<(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b494e6b58845e60c37350325d48268',1,'operator<<(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f12be0b00cb28aa3a721b8dc96c9bc',1,'operator<<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga519fefe984648ac2ccb3778d3ed0b48b',1,'operator<<(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8f7159a55b4df5308fa03b531586fb2b',1,'std::operator<<(std::basic_ostream< _Ch, _Tr > &__os, const __shared_ptr< _Tp, _Lp > &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga2ba7b3cbabd5345e19d26796f766c6c0',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__os, const complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8d0f4660661dc80ee079bdfa88eebd2b',1,'std::operator<<(_Ostream &&__os, const _Tp &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga1e56f8bee410b0ebf924661d35faf834',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga3e80f96ee978fcba07dec04a3d9e1f3b',1,'std::operator<<(basic_ostream< _Ch_type, _Ch_traits > &__os, const sub_match< _Bi_iter > &__m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#ga268e36f52e1a1ba938eeaa95509796ca',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_int_distribution< _IntType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gad31a64335591da810bc4719b847783ec',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_real_distribution< _RealType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac4faea5494eaad9201d45d8687792782',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__os, const __gnu_cxx::__versa_string< _CharT, _Traits, _Alloc, _Base > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabc0fe37b26c3b5de242cd4261cde3aed',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::cauchy_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga17d284660a1656bc205dd834125e5543',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::bernoulli_distribution &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga50ccdd252598b9c017837d26588463d2',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::geometric_distribution< _IntType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga24847f7a1a655893e956f636db4e9f3a',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::exponential_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5d78bcb5583afa9e1871301f9d6d9c68',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::weibull_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga65897cd1a592c0a6c399072ec1ef7192',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::extreme_value_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7ce367a2dac030dcf212d89846f6c6ff',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__os, const basic_string< _CharT, _Traits, _Alloc > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a20aaa750b7ddf43635768c7b2d0385e6',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const bitset< _Nb > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4162d00742462ffb4e5b792edd81e594',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afe8641d2d416e2c56bae3ae4294de5f9',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abb2dcd26142d2d22961a30d8407161be',1,'std::operator<<(basic_ostream< char, _Traits > &__out, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a105a937bc8d1394e0bb683dea33b9f1b',1,'std::operator<<(basic_ostream< char, _Traits > &__out, signed char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4b69f99d144efda14d0e97f2eda925a7',1,'std::operator<<(basic_ostream< char, _Traits > &__out, unsigned char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6c05be9ccf056df69e524be5751af66b',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa6c746960bcd91f0e547628fb5f04cde',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6d6a581dcdff7c878cd963e5f14c0c56',1,'std::operator<<(basic_ostream< char, _Traits > &__out, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af3b2cf95d3db957b00a07c89c708fee2',1,'std::operator<<(basic_ostream< char, _Traits > &__out, const signed char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9d1f9961c2210c515937937c3a75b28e',1,'std::operator<<(basic_ostream< char, _Traits > &__out, const unsigned char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html#a75a3eb00bb313c120599e8341bf27d16',1,'std::__detail::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const _Quoted_string< _String, _CharT > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html#a5e78e46b4d59d40bf8839a5cb176fa6a',1,'std::__detail::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const _Quoted_string< const _CharT *, _CharT > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gaf5eb3c897d120abd3981d431b0c57b35',1,'std::tr2::operator<<()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga17d284660a1656bc205dd834125e5543',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::bernoulli_distribution &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga50ccdd252598b9c017837d26588463d2',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::geometric_distribution< _IntType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga2ba7b3cbabd5345e19d26796f766c6c0',1,'operator<<(basic_ostream< _CharT, _Traits > &__os, const complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gaf5eb3c897d120abd3981d431b0c57b35',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const dynamic_bitset< _WordT, _Alloc > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabc0fe37b26c3b5de242cd4261cde3aed',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::cauchy_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8f7159a55b4df5308fa03b531586fb2b',1,'operator<<(std::basic_ostream< _Ch, _Tr > &__os, const __shared_ptr< _Tp, _Lp > &__p)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga24847f7a1a655893e956f636db4e9f3a',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::exponential_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5d78bcb5583afa9e1871301f9d6d9c68',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::weibull_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga65897cd1a592c0a6c399072ec1ef7192',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::extreme_value_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga1e56f8bee410b0ebf924661d35faf834',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga3e80f96ee978fcba07dec04a3d9e1f3b',1,'operator<<(basic_ostream< _Ch_type, _Ch_traits > &__os, const sub_match< _Bi_iter > &__m)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#ga268e36f52e1a1ba938eeaa95509796ca',1,'operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_int_distribution< _IntType > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gad31a64335591da810bc4719b847783ec',1,'operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_real_distribution< _RealType > &)(Global Namespace)']]], - ['operator_3c_3c_3d_120',['operator<<=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac36920b534a80be4cc1e6e80c68d2be5',1,'std::bitset::operator<<=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac36920b534a80be4cc1e6e80c68d2be5',1,'std::bitset::operator<<=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga30a493dbd85a2271bcc09d9d24f387b2',1,'std::gslice_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga43fc95bcbd0f89c0468f249209eb587b',1,'std::indirect_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc9fb4be42ab111a8b17efc9480006c7',1,'std::mask_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15a72598162a7183c3be5cfdcb43a94b',1,'std::slice_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a0052dae6eec21a15abee0bb7f339611d',1,'std::tr2::dynamic_bitset::operator<<=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a0052dae6eec21a15abee0bb7f339611d',1,'std::tr2::dynamic_bitset::operator<<=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga435a2811affb685f15934a9204bed29e',1,'std::valarray::operator<<=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9635c78d05a1fcbc22885223c1432f25',1,'std::valarray::operator<<=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga435a2811affb685f15934a9204bed29e',1,'valarray< size_t >::operator<<=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9635c78d05a1fcbc22885223c1432f25',1,'valarray< size_t >::operator<<=(const valarray< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga30a493dbd85a2271bcc09d9d24f387b2',1,'operator<<=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga435a2811affb685f15934a9204bed29e',1,'operator<<=(const _Tp &)(Global Namespace)']]], - ['operator_3c_3d_121',['operator<=',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a630e58dd233abf6b6ff3393be67454c0',1,'cv::MatExpr::operator<=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abeea3d9de568017193b26eea645c98f3',1,'cv::MatExpr::operator<=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a21b436ed46cb4ec5a3628576a10190fe',1,'cv::MatExpr::operator<=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0a628b41fded09b2e899b46836590de3',1,'cv::MatExpr::operator<=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8a039003baebfa48ba24de81f7f4d931',1,'cv::MatExpr::operator<=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a630e58dd233abf6b6ff3393be67454c0',1,'cv::MatExpr::operator<=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abeea3d9de568017193b26eea645c98f3',1,'cv::MatExpr::operator<=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a21b436ed46cb4ec5a3628576a10190fe',1,'cv::MatExpr::operator<=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0a628b41fded09b2e899b46836590de3',1,'cv::MatExpr::operator<=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8a039003baebfa48ba24de81f7f4d931',1,'cv::MatExpr::operator<=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaa804bf096018d007e2a7894cdb98037a',1,'cv::softdouble::operator<=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6c17bb1577e0284585be0ba580811e8f',1,'cv::softfloat::operator<=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga02b1b9dcfcefdfb34dadf0cd35ba61a3',1,'cv::operator<=()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1ead1ff269aa97694b6497d29e1e29c',1,'cv::cudev::operator<=(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa62bc6367673e025ae709593a9b656e5',1,'cv::cudev::operator<=(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23f1ab559dd9692502ce026417f45408',1,'cv::cudev::operator<=(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78bf3eb6d82e42dc66cf49fb78f79231',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19f33206e415060c1a0ea1eb3000d96b',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffe8680754ff4aa69ba039a79faf6626',1,'cv::cudev::operator<=(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1da871666d7dd2e618b145e8864929e8',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga701bfc015fbda0963f2803b27aca4d33',1,'cv::cudev::operator<=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff9c454089fcf80143cd32fa50238fcd',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23bf29cabff89d8549d818ef43147c14',1,'cv::cudev::operator<=(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga296d4d026d70f8f76aab066328f3d3fa',1,'cv::cudev::operator<=(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45ca16669f94b285db4334a262f80063',1,'cv::cudev::operator<=(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22e88dd408d2e5cff64faeab249681ba',1,'cv::cudev::operator<=(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a750fb20efa2f5a06000ccf33cd759b',1,'cv::cudev::operator<=(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ce34596d222bf804c1e9bf7e3d1243',1,'cv::cudev::operator<=(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11bdd191156ebdab62005a519b325200',1,'cv::cudev::operator<=(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b2b32ec5290e7e12efc0856bd5f743',1,'cv::cudev::operator<=(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf04bc7968693077bc7d4f2823645b88e',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga008bc5070a5b0e4af5cf5191f5d6b9d6',1,'cv::cudev::operator<=(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a9a3aa7951e9c0e8d8adfbda9a72209',1,'cv::cudev::operator<=(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga818519c31a2652549a00cd4d7393d79e',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab796146ad2e11416ac65fba37c0b8625',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07ebffec69ff52e0b06760664c1f6734',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadb89b24d295438f54277d245ece9366',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fc00541a0243c34358a3bf00f4da05a',1,'cv::cudev::operator<=(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90197d0db673130bc8a100773411d4bd',1,'cv::cudev::operator<=(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7e43a07a9aa0a10c8d37116f06bd9a',1,'cv::cudev::operator<=(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc2939c217e196e51ecd1b2a3e06c153',1,'cv::cudev::operator<=(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fe4a35b631b3aaa2e0e857bcbbd6bad',1,'cv::cudev::operator<=(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae309099345eee12887e40f5b0b050f3e',1,'cv::cudev::operator<=(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad102af955636969a42dbffc6dbb01b46',1,'cv::cudev::operator<=(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc0e7fca81b7c89968d39d89dc649b7a',1,'cv::cudev::operator<=(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21fc2950b93de4f956fbaf0758feb6a1',1,'cv::cudev::operator<=(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d7b36c9336f6fc1a843e54c4df8f0e',1,'cv::cudev::operator<=(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41851377c29b820cf0506e6a0e709782',1,'cv::cudev::operator<=(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12057494f0e2df897df3fc9841779e4d',1,'cv::cudev::operator<=(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10792a96e7eb2e17bb8163ef90a323b4',1,'cv::cudev::operator<=(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7fbfe98286073cd2a5660902a39f04',1,'cv::cudev::operator<=(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a1bebcff32a1bf7d2575d05bfeb7890',1,'cv::cudev::operator<=(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff6fe97435e41e89de0bdef31594a96',1,'cv::cudev::operator<=(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa56d3d64ea9d3eb351f5df4712c7d56f',1,'cv::cudev::operator<=(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468b559ecf6624521e1c1dd45ef6d2e6',1,'cv::cudev::operator<=(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc5c1c549707034c570459ffee3e806',1,'cv::cudev::operator<=(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9643b2618b16b6ab86f270012d70212a',1,'cv::cudev::operator<=(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788e492c5f919e8367629179e2524611',1,'cv::cudev::operator<=(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb572141a492105ee211ba7c12d0777',1,'cv::cudev::operator<=(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5db9beb4e23e8a160a22aa678720a87',1,'cv::cudev::operator<=(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bed66c4065e1f21bc76995bfa99752b',1,'cv::cudev::operator<=(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e90fe2cf3b8c107bfe31aa0b2f94e3c',1,'cv::cudev::operator<=(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga576e04d2f78108d39b4461fcf6aded03',1,'cv::cudev::operator<=(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0c263dc40917991d1a7039432d3d4f9',1,'cv::cudev::operator<=(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5edc4d4087d24b678e8daf4926370ea',1,'cv::cudev::operator<=(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13f7090565e4f7e704870536ed987057',1,'cv::cudev::operator<=(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cd1eaa84e6d908ae0e907de12fdcde9',1,'cv::cudev::operator<=(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga375fc5f28c2b1e5962243287a28e5b58',1,'cv::cudev::operator<=(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab9131041d6fc4ae7360291aee9b26',1,'cv::cudev::operator<=(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f106914932b4cab06413eb2632ef2cd',1,'cv::cudev::operator<=(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04227753f6db79fdbfb9715240961a97',1,'cv::cudev::operator<=(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12191665fdc650dbf8500db71892fd0',1,'cv::cudev::operator<=(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1001c72e6391934b7daaf15c66ab0d7',1,'cv::cudev::operator<=(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75483e6deab8535ed86eb6dc65947e0f',1,'cv::cudev::operator<=(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72810c269851aae026716559fa2af537',1,'cv::cudev::operator<=(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14aafc9b0e4ab5e8090d0ac9a679583',1,'cv::cudev::operator<=(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23d29f809003619e6d82b5b7ea7de995',1,'cv::cudev::operator<=(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd09b7cc4b4786532fda053066dcbafd',1,'cv::cudev::operator<=(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31edb90c4322609ec771e66e4583739e',1,'cv::cudev::operator<=(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33819e2576485dff43ab99ca0e19560e',1,'cv::cudev::operator<=(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b66f84f7275665c91b9fed5aed59be5',1,'cv::cudev::operator<=(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35728a641902e5d67a7531342d2d43a1',1,'cv::cudev::operator<=(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e1e3238a8f002f82a398ca042d3db2',1,'cv::cudev::operator<=(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37b679d33d766b5ce00013e7c96fc4c',1,'cv::cudev::operator<=(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56fd29329dd70b608a25f8f8b462562f',1,'cv::cudev::operator<=(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92c40110cfc6a7a10651b46b15c7533e',1,'cv::cudev::operator<=(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b2a3a801109a2a06e5da8675728fe58',1,'cv::cudev::operator<=(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga250eb7cdcb64312f4e2641501dc9baee',1,'cv::cudev::operator<=(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f0089cb1db00710fd7233770bc30b60',1,'cv::cudev::operator<=(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef2bba33802f57daa91e22602079a3a7',1,'cv::cudev::operator<=(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c460da93b4a465dbb65ea6c98d08e0',1,'cv::cudev::operator<=(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247f899b55928b075fc919076f5e5949',1,'cv::cudev::operator<=(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga914be25957de16f44b85396ba88a7f5d',1,'cv::cudev::operator<=(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e5a6258674087258ec46bf94c668353',1,'cv::cudev::operator<=(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2dbc819cf82263e9ec490552404734',1,'cv::cudev::operator<=(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eff31462c5876d989bad00f346ab183',1,'cv::cudev::operator<=(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03fe55d350f74009fef23cbf85c265c4',1,'cv::cudev::operator<=(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad73033b2ed798b55ac0e978547e2dcdd',1,'cv::cudev::operator<=(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08dfbf27c72c08bc5b257948694cc3e1',1,'cv::cudev::operator<=(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7460f2ca99c07231e71c964b4b584ac',1,'cv::cudev::operator<=(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b414d7742537f5def6a1f1dbbcee688',1,'cv::cudev::operator<=(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a1f07e6149542f2488750c2af3c068',1,'cv::cudev::operator<=(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc181ce10142dbd76ee1376a3cd90fdd',1,'cv::cudev::operator<=(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40b2bb5b5a77fa89913fb57853cde453',1,'cv::cudev::operator<=(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac06f6f101ec8cfcaf490ec6f041a837f',1,'cv::cudev::operator<=(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8e0bfab992ab8a121c15af1e82829ac',1,'cv::cudev::operator<=(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e24ea99fa24b52f3669e40c16c2a0f7',1,'cv::cudev::operator<=(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1e079957fbf820718af8a90067d68a9',1,'cv::cudev::operator<=(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93b6391a06707b6be2ca59da57057086',1,'cv::cudev::operator<=(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61706e65d948e11d869534a6653c00bf',1,'cv::cudev::operator<=(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99abc45e21e9f42fd926a8e83cdab296',1,'cv::cudev::operator<=(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba541b96bbc1af333e8a13eb1dc169d',1,'cv::cudev::operator<=(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7a9638a0e70f17231a9e10fecedb0b2',1,'cv::cudev::operator<=(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga455fe5a0dbcd6e20648e5bc2dd13fd6c',1,'cv::cudev::operator<=(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2618b57557803d2ac6d3450904bf7e6',1,'cv::cudev::operator<=(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ad206b773be555181e771e60d3d80d',1,'cv::cudev::operator<=(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2589f700026397ad0058d21462da1714',1,'cv::cudev::operator<=(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac57dc63fcc9e6782a2af19c0a14bf769',1,'cv::cudev::operator<=(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5f991c778ac1f18cd26ec9a6ae5ff72',1,'cv::cudev::operator<=(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7a1cc2de07b5b85ef8a5b16d01e487b',1,'cv::cudev::operator<=(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa452eeb5d53100bd938b7e1bb338d995',1,'cv::cudev::operator<=(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987b56ea0c72d063c0556dd6cac14929',1,'cv::cudev::operator<=(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9292c118b4add3d2e427413547c585fb',1,'cv::cudev::operator<=(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546cd23c9536ca329dbc1c6cccb7497',1,'cv::cudev::operator<=(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ec0c62ac154d66d9623f15fdac7c91',1,'cv::cudev::operator<=(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f767e3bf13cbd06503128dae485024',1,'cv::cudev::operator<=(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e42dbf144296f0d9586569a04f490',1,'cv::cudev::operator<=(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga616315867d4da80fdfe8216599b6537e',1,'cv::cudev::operator<=(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92fbe24a4d7fc8e87ea5663cad49fcf1',1,'cv::cudev::operator<=(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73c4504f2ad38a1eb98bcf0da9989196',1,'cv::cudev::operator<=(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga525f070d7c6ab195d7c415794a412214',1,'cv::cudev::operator<=(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb29143e8afd81a0c0f520bb43c16b6',1,'cv::cudev::operator<=(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cb74c8f5ee39656481d92ba33911254',1,'cv::cudev::operator<=(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6c17bb1577e0284585be0ba580811e8f',1,'operator<=(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaa804bf096018d007e2a7894cdb98037a',1,'operator<=(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga02b1b9dcfcefdfb34dadf0cd35ba61a3',1,'operator<=(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1ead1ff269aa97694b6497d29e1e29c',1,'operator<=(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa62bc6367673e025ae709593a9b656e5',1,'operator<=(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23f1ab559dd9692502ce026417f45408',1,'operator<=(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78bf3eb6d82e42dc66cf49fb78f79231',1,'operator<=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19f33206e415060c1a0ea1eb3000d96b',1,'operator<=(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffe8680754ff4aa69ba039a79faf6626',1,'operator<=(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1da871666d7dd2e618b145e8864929e8',1,'operator<=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga701bfc015fbda0963f2803b27aca4d33',1,'operator<=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff9c454089fcf80143cd32fa50238fcd',1,'operator<=(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23bf29cabff89d8549d818ef43147c14',1,'operator<=(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga296d4d026d70f8f76aab066328f3d3fa',1,'operator<=(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45ca16669f94b285db4334a262f80063',1,'operator<=(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22e88dd408d2e5cff64faeab249681ba',1,'operator<=(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a750fb20efa2f5a06000ccf33cd759b',1,'operator<=(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ce34596d222bf804c1e9bf7e3d1243',1,'operator<=(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11bdd191156ebdab62005a519b325200',1,'operator<=(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b2b32ec5290e7e12efc0856bd5f743',1,'operator<=(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf04bc7968693077bc7d4f2823645b88e',1,'operator<=(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga008bc5070a5b0e4af5cf5191f5d6b9d6',1,'operator<=(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a9a3aa7951e9c0e8d8adfbda9a72209',1,'operator<=(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga818519c31a2652549a00cd4d7393d79e',1,'operator<=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab796146ad2e11416ac65fba37c0b8625',1,'operator<=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07ebffec69ff52e0b06760664c1f6734',1,'operator<=(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadb89b24d295438f54277d245ece9366',1,'operator<=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fc00541a0243c34358a3bf00f4da05a',1,'operator<=(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90197d0db673130bc8a100773411d4bd',1,'operator<=(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7e43a07a9aa0a10c8d37116f06bd9a',1,'operator<=(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc2939c217e196e51ecd1b2a3e06c153',1,'operator<=(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fe4a35b631b3aaa2e0e857bcbbd6bad',1,'operator<=(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae309099345eee12887e40f5b0b050f3e',1,'operator<=(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad102af955636969a42dbffc6dbb01b46',1,'operator<=(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc0e7fca81b7c89968d39d89dc649b7a',1,'operator<=(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21fc2950b93de4f956fbaf0758feb6a1',1,'operator<=(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d7b36c9336f6fc1a843e54c4df8f0e',1,'operator<=(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41851377c29b820cf0506e6a0e709782',1,'operator<=(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12057494f0e2df897df3fc9841779e4d',1,'operator<=(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10792a96e7eb2e17bb8163ef90a323b4',1,'operator<=(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7fbfe98286073cd2a5660902a39f04',1,'operator<=(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a1bebcff32a1bf7d2575d05bfeb7890',1,'operator<=(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff6fe97435e41e89de0bdef31594a96',1,'operator<=(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa56d3d64ea9d3eb351f5df4712c7d56f',1,'operator<=(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468b559ecf6624521e1c1dd45ef6d2e6',1,'operator<=(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc5c1c549707034c570459ffee3e806',1,'operator<=(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9643b2618b16b6ab86f270012d70212a',1,'operator<=(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788e492c5f919e8367629179e2524611',1,'operator<=(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb572141a492105ee211ba7c12d0777',1,'operator<=(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5db9beb4e23e8a160a22aa678720a87',1,'operator<=(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bed66c4065e1f21bc76995bfa99752b',1,'operator<=(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e90fe2cf3b8c107bfe31aa0b2f94e3c',1,'operator<=(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga576e04d2f78108d39b4461fcf6aded03',1,'operator<=(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0c263dc40917991d1a7039432d3d4f9',1,'operator<=(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5edc4d4087d24b678e8daf4926370ea',1,'operator<=(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13f7090565e4f7e704870536ed987057',1,'operator<=(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cd1eaa84e6d908ae0e907de12fdcde9',1,'operator<=(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga375fc5f28c2b1e5962243287a28e5b58',1,'operator<=(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab9131041d6fc4ae7360291aee9b26',1,'operator<=(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f106914932b4cab06413eb2632ef2cd',1,'operator<=(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04227753f6db79fdbfb9715240961a97',1,'operator<=(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12191665fdc650dbf8500db71892fd0',1,'operator<=(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1001c72e6391934b7daaf15c66ab0d7',1,'operator<=(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75483e6deab8535ed86eb6dc65947e0f',1,'operator<=(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72810c269851aae026716559fa2af537',1,'operator<=(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14aafc9b0e4ab5e8090d0ac9a679583',1,'operator<=(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23d29f809003619e6d82b5b7ea7de995',1,'operator<=(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd09b7cc4b4786532fda053066dcbafd',1,'operator<=(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31edb90c4322609ec771e66e4583739e',1,'operator<=(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33819e2576485dff43ab99ca0e19560e',1,'operator<=(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b66f84f7275665c91b9fed5aed59be5',1,'operator<=(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35728a641902e5d67a7531342d2d43a1',1,'operator<=(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e1e3238a8f002f82a398ca042d3db2',1,'operator<=(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37b679d33d766b5ce00013e7c96fc4c',1,'operator<=(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56fd29329dd70b608a25f8f8b462562f',1,'operator<=(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92c40110cfc6a7a10651b46b15c7533e',1,'operator<=(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b2a3a801109a2a06e5da8675728fe58',1,'operator<=(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga250eb7cdcb64312f4e2641501dc9baee',1,'operator<=(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f0089cb1db00710fd7233770bc30b60',1,'operator<=(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef2bba33802f57daa91e22602079a3a7',1,'operator<=(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c460da93b4a465dbb65ea6c98d08e0',1,'operator<=(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247f899b55928b075fc919076f5e5949',1,'operator<=(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga914be25957de16f44b85396ba88a7f5d',1,'operator<=(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e5a6258674087258ec46bf94c668353',1,'operator<=(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2dbc819cf82263e9ec490552404734',1,'operator<=(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eff31462c5876d989bad00f346ab183',1,'operator<=(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03fe55d350f74009fef23cbf85c265c4',1,'operator<=(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad73033b2ed798b55ac0e978547e2dcdd',1,'operator<=(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08dfbf27c72c08bc5b257948694cc3e1',1,'operator<=(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7460f2ca99c07231e71c964b4b584ac',1,'operator<=(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b414d7742537f5def6a1f1dbbcee688',1,'operator<=(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a1f07e6149542f2488750c2af3c068',1,'operator<=(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc181ce10142dbd76ee1376a3cd90fdd',1,'operator<=(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40b2bb5b5a77fa89913fb57853cde453',1,'operator<=(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac06f6f101ec8cfcaf490ec6f041a837f',1,'operator<=(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8e0bfab992ab8a121c15af1e82829ac',1,'operator<=(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e24ea99fa24b52f3669e40c16c2a0f7',1,'operator<=(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1e079957fbf820718af8a90067d68a9',1,'operator<=(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93b6391a06707b6be2ca59da57057086',1,'operator<=(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61706e65d948e11d869534a6653c00bf',1,'operator<=(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99abc45e21e9f42fd926a8e83cdab296',1,'operator<=(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba541b96bbc1af333e8a13eb1dc169d',1,'operator<=(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7a9638a0e70f17231a9e10fecedb0b2',1,'operator<=(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga455fe5a0dbcd6e20648e5bc2dd13fd6c',1,'operator<=(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2618b57557803d2ac6d3450904bf7e6',1,'operator<=(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ad206b773be555181e771e60d3d80d',1,'operator<=(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2589f700026397ad0058d21462da1714',1,'operator<=(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac57dc63fcc9e6782a2af19c0a14bf769',1,'operator<=(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5f991c778ac1f18cd26ec9a6ae5ff72',1,'operator<=(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7a1cc2de07b5b85ef8a5b16d01e487b',1,'operator<=(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa452eeb5d53100bd938b7e1bb338d995',1,'operator<=(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987b56ea0c72d063c0556dd6cac14929',1,'operator<=(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9292c118b4add3d2e427413547c585fb',1,'operator<=(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546cd23c9536ca329dbc1c6cccb7497',1,'operator<=(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ec0c62ac154d66d9623f15fdac7c91',1,'operator<=(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f767e3bf13cbd06503128dae485024',1,'operator<=(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e42dbf144296f0d9586569a04f490',1,'operator<=(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga616315867d4da80fdfe8216599b6537e',1,'operator<=(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92fbe24a4d7fc8e87ea5663cad49fcf1',1,'operator<=(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73c4504f2ad38a1eb98bcf0da9989196',1,'operator<=(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga525f070d7c6ab195d7c415794a412214',1,'operator<=(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb29143e8afd81a0c0f520bb43c16b6',1,'operator<=(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cb74c8f5ee39656481d92ba33911254',1,'operator<=(double s, const double4 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a8002d09a2b548cf3abc2bd4aeafbce78',1,'__gnu_cxx::operator<=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a08ad6f0a285af9120e6d882594281672',1,'__gnu_cxx::operator<=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a3672b11b2bb1fc3a4b22f6d29473af87',1,'__gnu_cxx::operator<=(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a930dd0467ade4b159f585b09a918c395',1,'std::operator<=(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8d12abc1fb7e7cd1c53769a0fc5ff75f',1,'std::operator<=(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9e2bd7d69af9d03b7df4858595a3202e',1,'std::operator<=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#adb3e9ff06db8a5cc1105aaea9e01abd2',1,'std::operator<=(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5b152596ab130d1c97908b694e5fd761',1,'std::operator<=(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga6d0ebab63e2fcfb19ad69237091d4d7f',1,'std::operator<=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a54c920ed5017335b380d77d540169c76',1,'std::operator<=(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fd4bec06d2b472f7002ee98aea643af',1,'std::operator<=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gac012e10e6bb4ba58875ad515b9b9f05d',1,'std::operator<=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga490e9054301cbb70120a6b0202cee45d',1,'std::operator<=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5620ce8b20ede9f7494a66af23212304',1,'std::operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga84b53be86a6dfea454c23d5207d0864d',1,'std::operator<=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af19b07884ac9b3b0986b70d79bdc7ec1',1,'std::operator<=(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a407132a3a46dfa53d8f1e7810ee5b54d',1,'std::operator<=(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeb2fd054122ecce964976201c05a73cc',1,'std::operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acc2c10d2a7234cc66fd327a6f65954f7',1,'std::operator<=(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab0de944941fcbe6618dba4837b31deaa',1,'std::operator<=(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8921c2d57c14b7e9702a9500bde8aba9',1,'std::operator<=(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a25c829a4d9c4e577f0b11223bd00aced',1,'std::operator<=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac39a97945b49c71df0816226ff72807f',1,'std::operator<=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a72de11bf9e31d206cda3e333812a3f5a',1,'std::operator<=(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a00e5655f35d242d0995153643aea2ebc',1,'std::__debug::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a513766abdb4ed2ba58d8792147ebf811',1,'std::__profile::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#aaf5340c412fb69ca76ea39d768f04ce4',1,'std::rel_ops::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gae39d9fee6e2bb1642be73a0474be71b3',1,'std::tr2::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gae39d9fee6e2bb1642be73a0474be71b3',1,'operator<=(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga6d0ebab63e2fcfb19ad69237091d4d7f',1,'operator<=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fd4bec06d2b472f7002ee98aea643af',1,'operator<=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gac012e10e6bb4ba58875ad515b9b9f05d',1,'operator<=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga490e9054301cbb70120a6b0202cee45d',1,'operator<=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5620ce8b20ede9f7494a66af23212304',1,'operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga84b53be86a6dfea454c23d5207d0864d',1,'operator<=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeb2fd054122ecce964976201c05a73cc',1,'operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9e2bd7d69af9d03b7df4858595a3202e',1,'operator<=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], - ['operator_3d_122',['operator=',['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a76321e46a6c9fd0cb68c1ecc862cb515',1,'cv::util::any::operator=(any &&)=default'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a825b496ef0087775e11beb91d157d0c8',1,'cv::util::any::operator=(any const &src)'],['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a13709e8c99dac446a1c1ed71798eee72',1,'cv::AsyncArray::operator=()'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#aa39cabdf05e3b14aadee5dec3e7baa0e',1,'cv::AsyncPromise::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'cv::AutoBuffer::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'AutoBuffer< double, 1 >::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'AutoBuffer< int64, 1 >::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'AutoBuffer< String, 1 >::operator=()'],['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#a52a7237f767b8d0269724c481329b6d5',1,'cv::detail::CameraParams::operator=()'],['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#a1b7982e6ea32e8653ae0543ff0a81354',1,'cv::CommandLineParser::operator=()'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a43a8ac6dd8cb0d342d39a65acf402217',1,'cv::ocl::Context::operator=()'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1gapi_1_1wip_1_1Data.html#a3ae38e8c51ce271fab188d7da2272fed',1,'cv::gapi::wip::Data::operator=(const T &t)'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1gapi_1_1wip_1_1Data.html#a5e490199d72c9f1c81663c3225c893d2',1,'cv::gapi::wip::Data::operator=(T &&t)'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a1b0465bff476900efb5ca2f238563997',1,'cv::ocl::Device::operator=()'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#acc5ccf38e7abf268d032074cff8d5cc2',1,'cv::dnn::DictValue::operator=()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7b1a3493d50b1d4fb636aa1550cdce34',1,'cv::FileNode::operator=()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#aeffb68f308d077062d0ced1a57ebd489',1,'cv::FileNodeIterator::operator=()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ad1432eed28a34f995a641a296281e01c',1,'cv::cuda::GpuMat::operator=()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a3e2a15bc4185f48943ed354e1b927ad6',1,'cv::cudev::GpuMat_::operator=(const GpuMat_ &m)'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a6075adc7a8150ea7069235c7793b7c69',1,'cv::cudev::GpuMat_::operator=(const Expr< Body > &expr)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a086c7947f5c106c9b238ba9dcbcb2f1c',1,'cv::cuda::HostMem::operator=()'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#a1034c0afe903b367b0f47c1916d9616f',1,'cv::ocl::Image2D::operator=()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#aa2694f462b29140fd21bc0e6f5380f0b',1,'cv::ocl::Kernel::operator=()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aed1f81fe7efaacc2bd95149cdfa34302',1,'cv::Mat::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a2a0798475170fb3a23b5bc63686de334',1,'cv::Mat::operator=(const MatExpr &expr)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa5c947f7e449a4d856a4f3a87fcebd50',1,'cv::Mat::operator=(const Scalar &s)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a86d190d68dbd801a2bd555d0905979fd',1,'cv::Mat::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a125f510bec573808666906a95ea09cb4',1,'cv::gapi::own::Mat::operator=(Mat const &src)=default'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#aa9caec4b6b0cf0f7ae8bb7808154d594',1,'cv::gapi::own::Mat::operator=(Mat &&src)=default'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a3709c060fa62e45132ab1932a73803c8',1,'cv::gapi::own::Mat::operator=(const Scalar &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'cv::Mat_::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'cv::Mat_::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'cv::Mat_::operator=(const _Tp &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'cv::Mat_::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'cv::Mat_::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'cv::Mat_::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< double >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< double >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< double >::operator=(const double &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< double >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< double >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< double >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< float >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< float >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< float >::operator=(const float &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< float >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< float >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< float >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< uchar >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< uchar >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< uchar >::operator=(const uchar &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< uchar >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< uchar >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< uchar >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< unsigned char >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< unsigned char >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< unsigned char >::operator=(const unsigned char &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< unsigned char >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< unsigned char >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< unsigned char >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#ae5b2d39c2deb60c6db6202034e28182d',1,'cv::detail::MatchesInfo::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#af1c80909af2a28c1b98c6bf1f53984d7',1,'cv::MatConstIterator::operator=()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#af7430e2fa55817bdd66753a5af7f3242',1,'cv::MatConstIterator_::operator=()'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#af31e606676d1cd6bdeedcbdd1ea4fb41',1,'cv::gapi::own::detail::MatHeader::operator=(const MatHeader &)=default'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#ac6efb1a462a75da9fad1c38cbbc99bac',1,'cv::gapi::own::detail::MatHeader::operator=(MatHeader &&src)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a531046b556e382f91c55e3076083f051',1,'cv::MatIterator_::operator=()'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a325af086a8a2a9be290ca92d3b4946c5',1,'cv::MatStep::operator=(size_t s)'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a9927dacc19715875bf7518207445e0ad',1,'cv::MatStep::operator=(const MatStep &)'],['https://docs.opencv.org/4.2.0/d7/dc2/classcv_1_1instr_1_1NodeData.html#af66d2f09b331f5de963a2cfa0d7ba21e',1,'cv::instr::NodeData::operator=()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a2e6daae54312f1bbe7a832e8083a7af9',1,'cv::util::optional::operator=(const optional &rhs)=default'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a11564f1271c6c1aa95c98ba7385c6779',1,'cv::util::optional::operator=(optional &&rhs)'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#ad7a69d27e55090b7019236b251d57a81',1,'cv::ocl::Platform::operator=()'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#ad25bce73d8db1173fd08fe631e2a2389',1,'cv::ocl::PlatformInfo::operator=()'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a892446cde2db30f149f572b92619dc9f',1,'cv::Point3_::operator=(const Point3_ &pt)'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a272296b0541449dbe926deb557f18fa7',1,'cv::Point3_::operator=(Point3_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'cv::Point_::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'cv::Point_::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'Point_< double >::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'Point_< double >::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'Point_< float >::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'Point_< float >::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'Point_< int >::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'Point_< int >::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a9d76780ecc8d97fe76ef926123c507c0',1,'cv::ocl::Program::operator=()'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#ac472f17bd1ee3bab677b38e773d82638',1,'cv::ocl::ProgramSource::operator=()'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#acaf2d9afbd65c6ade583f73a2c5023e5',1,'cv::ocl::Queue::operator=()'],['https://docs.opencv.org/4.2.0/d3/d22/classcv_1_1gapi_1_1own_1_1Rect.html#aca0529ecae368b5027176331f4257bd4',1,'cv::gapi::own::Rect::operator=()'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#ab9b239b3562b94f07e46551d05af97c6',1,'cv::Rect_::operator=(const Rect_ &r)'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a8228f59c183fca9695ae329dc773a3e1',1,'cv::Rect_::operator=(Rect_ &&r) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ad95d917b9fb9a0053929b2b5c84bb5b2',1,'cv::Scalar_::operator=(const Scalar_ &s)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a8ea9d461de3c6e04f64c2f2ee1751cd2',1,'cv::Scalar_::operator=(Scalar_ &&s) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ad95d917b9fb9a0053929b2b5c84bb5b2',1,'Scalar_< double >::operator=(const Scalar_ &s)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a8ea9d461de3c6e04f64c2f2ee1751cd2',1,'Scalar_< double >::operator=(Scalar_ &&s) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#aa126ea44724ae43d1fc1597397d9b3f5',1,'cv::gapi::own::Size::operator=()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a7a115285576d3211b24bda4628ee7f4d',1,'cv::Size_::operator=(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#aa7a87199e67360f44636ec30b1183fcd',1,'cv::Size_::operator=(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a7a115285576d3211b24bda4628ee7f4d',1,'Size_< float >::operator=(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#aa7a87199e67360f44636ec30b1183fcd',1,'Size_< float >::operator=(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf80704eb7bfc3257da30ad5a82fb9de',1,'cv::softdouble::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9451cdb3a66bebcc1f5e8b409f780b7f',1,'cv::softfloat::operator=()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a144c0f1ec1d3ffc20305bc4d1747b741',1,'cv::SparseMat::operator=(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a9e634f2d73a077444df4395e50821129',1,'cv::SparseMat::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#aa9ea60ee22d3ba75ccb16365eda3f096',1,'cv::SparseMat_::operator=(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a3a90de6441880eae3ba875a0fed2700e',1,'cv::SparseMat_::operator=(const SparseMat_ &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#aebaca1182543e7e71ee5c4f73a088c90',1,'cv::SparseMat_::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a9ad2aca73fd447e5642b1c21bd978cd3',1,'cv::SparseMatConstIterator::operator=()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#afe543867ec13099311670ad837eab611',1,'cv::SparseMatConstIterator_::operator=()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a69fe44b15c6618424367d24b8b99b9e4',1,'cv::SparseMatIterator::operator=()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#ad1d385d5c83a9c1104e9a197e331881c',1,'cv::SparseMatIterator_::operator=()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aac5e0ed13076c2371fa41d215a49b17f',1,'cv::UMat::operator=(const UMat &m)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a245c83dba9f05fc44d44d557f86101f1',1,'cv::UMat::operator=(const Scalar &s)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a561c1a335882bfe799e4235ee8fb67a6',1,'cv::UMat::operator=(UMat &&m)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a06701f71c52af321d833f6f3fdcfb89f',1,'cv::util::variant::operator=(const variant &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#abcd060a1b68f44893b2f15547f46b1d1',1,'cv::util::variant::operator=(variant &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a5d690841b784f348c9db1e741de8be0e',1,'cv::util::variant::operator=(T &&t) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a37e79528fb523179954532c12afb3e5b',1,'cv::util::variant::operator=(const variant< Ts... > &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a0f2388dd0dd28e24b5842cd1b432008c',1,'cv::util::variant::operator=(variant< Ts... > &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a06701f71c52af321d833f6f3fdcfb89f',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(const variant &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#abcd060a1b68f44893b2f15547f46b1d1',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(variant &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a5d690841b784f348c9db1e741de8be0e',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(T &&t) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a37e79528fb523179954532c12afb3e5b',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(const variant< Ts... > &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a0f2388dd0dd28e24b5842cd1b432008c',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(variant< Ts... > &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#afced2add96752159cd3a20f7592a528f',1,'cv::viz::Viz3d::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#a32e9fb3b4821e9aa0163c54fdcb8ce3c',1,'cv::viz::Widget::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a7bee901f7465419633250caa04983ef6',1,'__gnu_cxx::__versa_string::operator=(const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a46713802e19d9139db7468030060ebaf',1,'__gnu_cxx::__versa_string::operator=(__versa_string &&__str) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aa833376e55c1b6c75179e976043e6dd6',1,'__gnu_cxx::__versa_string::operator=(std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a01f0f4f2476992da89a882cb4f35c52e',1,'__gnu_cxx::__versa_string::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aa1d106b3b5ff8313d6d646f9aec5adc6',1,'__gnu_cxx::__versa_string::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#ae0afa6ce3f2e1d626b46ad157edb0a39',1,'__gnu_debug::_Safe_iterator::operator=(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a8289e4e52eca797212f8ed2f7ac06484',1,'__gnu_debug::_Safe_iterator::operator=(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#aa7d1bbc86a00f5af9a96cc55c7914cce',1,'__gnu_debug::_Safe_local_iterator::operator=(const _Safe_local_iterator &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a63641a3d3e09e8c2ef28e47d9f4b6057',1,'__gnu_debug::_Safe_local_iterator::operator=(_Safe_local_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#ae0afa6ce3f2e1d626b46ad157edb0a39',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator=(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a8289e4e52eca797212f8ed2f7ac06484',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator=(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#ae0afa6ce3f2e1d626b46ad157edb0a39',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator=(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a8289e4e52eca797212f8ed2f7ac06484',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator=(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< _CharT >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< _CharT >::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< _CharT >::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< _CharT >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< _CharT >::operator=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(_Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< char >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< char >::operator=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< char >::operator=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< char >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< char >::operator=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< char_type, _Traits, _Alloc >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< char_type, _Traits, _Alloc >::operator=(const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< char_type, _Traits, _Alloc >::operator=(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< char_type, _Traits, _Alloc >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< char_type, _Traits, _Alloc >::operator=(initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< value_type >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< value_type >::operator=(const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< value_type >::operator=(value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< value_type >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< value_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#acbbd2ced11be9e416c030bf3dcaeacad',1,'deque< _StateSeqT >::operator=(const deque &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a77734a257fa1c71752517d0ae6ae707d',1,'deque< _StateSeqT >::operator=(deque &&__x) noexcept(_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a74898d8b495f47ced979e6ba66c4eef1',1,'deque< _StateSeqT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a35a994d029c0e0cf92abf1f468cfa140',1,'list< __inp, __rebind_inp >::operator=(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8f9b65b72c23e8c124c5f4a6e11013e0',1,'list< __inp, __rebind_inp >::operator=(list &&__x) noexcept(_Node_alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b554a6eab6e57e565eedb7da72a83c5',1,'list< __inp, __rebind_inp >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aaa530908380c41e867d3d3d8d6dcf017',1,'match_results< _Bi_iter >::operator=(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a9066bb40864217bcf43710d9ea95bd86',1,'match_results< _Bi_iter >::operator=(match_results &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04755.html#af6ed2d0a405aee06f81dda8452a6e2ce',1,'std::__allocated_ptr::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#af798a3136d8030f2158837fde7373f5b',1,'std::auto_ptr::operator=(auto_ptr &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#adf78f102f371538dbe78a57976053736',1,'std::auto_ptr::operator=(auto_ptr< _Tp1 > &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#aa94f823e79ee65ed66fe128448d434ef',1,'std::back_insert_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a232af3b8f7c72e6c67ba9f3b6d1b256d',1,'std::basic_regex::operator=(const basic_regex &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a8d6c69a28d8c523cae6f7322095490d5',1,'std::basic_regex::operator=(basic_regex &&__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#aaf3c150b855c8dddc84f7a33519dba7f',1,'std::basic_regex::operator=(const _Ch_type *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#ae9f733548bcdaf906573129bed9c10fa',1,'std::basic_regex::operator=(initializer_list< _Ch_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a85898504e41caa15dfed44321f36c4c9',1,'std::basic_regex::operator=(const basic_string< _Ch_type, _Ch_traits, _Alloc > &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'std::basic_string::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'std::basic_string::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'std::basic_string::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'std::basic_string::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'std::basic_string::operator=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga92ff752125c60794c33d55db59b48105',1,'std::complex::operator=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaebc147a1a3a6e326215cd323aafa6bc6',1,'std::complex::operator=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#acbbd2ced11be9e416c030bf3dcaeacad',1,'std::deque::operator=(const deque &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a77734a257fa1c71752517d0ae6ae707d',1,'std::deque::operator=(deque &&__x) noexcept(_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a74898d8b495f47ced979e6ba66c4eef1',1,'std::deque::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a146ce22d8e7f66b46766d6de66fb6584',1,'std::experimental::fundamentals_v1::any::operator=(const any &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a0453d90a8d4fb2325712c4e5f3b909a7',1,'std::experimental::fundamentals_v1::any::operator=(any &&__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#af377e421f8e38d5873afb4d84aab606b',1,'std::experimental::fundamentals_v1::any::operator=(_ValueType &&__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a78c1273fb53228cab655addd77f9cd25',1,'std::forward_list::operator=(const forward_list &__list)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aaedecd0634ab8c057cca203778ea6cfa',1,'std::forward_list::operator=(forward_list &&__list) noexcept(_Node_alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a6b8dfcf0c3aad308699e909186c39f2b',1,'std::forward_list::operator=(std::initializer_list< _Tp > __il)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#ad88a7eabbaf51cfa7c8152e1c27d226f',1,'std::front_insert_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a698ecd83665a25c0c1f9cbe2ea85c2a0',1,'std::function< _Res(_ArgTypes...)>::operator=(const function &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a00bb39127d1936767cbfd81c4bb02354',1,'std::function< _Res(_ArgTypes...)>::operator=(function &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a05ea81faa27f6b5511b699634b83c4a8',1,'std::function< _Res(_ArgTypes...)>::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#afbb6bdd269617d2793d4dbbb078f6707',1,'std::function< _Res(_ArgTypes...)>::operator=(_Functor &&__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#afc4ca535d5508c13e9112b39c8c064d4',1,'std::function< _Res(_ArgTypes...)>::operator=(reference_wrapper< _Functor > __f) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga59fd646ebf243e99b2063baf37ba91d0',1,'std::gslice::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf25507c9a66f729500964d397b7cb9fb',1,'std::gslice_array::operator=(const gslice_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf2a0c3883cfb758e05e3d62ec7e0a07f',1,'std::gslice_array::operator=(const valarray< _Tp > &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8dfed8c043d7a82e4b71cf65c64ec844',1,'std::gslice_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga73cce032d98e922eeafb676920174f52',1,'std::indirect_array::operator=(const indirect_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6072ae14d756314665aef25c55cc4d33',1,'std::indirect_array::operator=(const valarray< _Tp > &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac17dafc8657c7fd6eab36a46260ff97f',1,'std::indirect_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a97b27e02a31008441dd0374c6a1021e4',1,'std::insert_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a35a994d029c0e0cf92abf1f468cfa140',1,'std::list::operator=(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8f9b65b72c23e8c124c5f4a6e11013e0',1,'std::list::operator=(list &&__x) noexcept(_Node_alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b554a6eab6e57e565eedb7da72a83c5',1,'std::list::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a21b4d6ac8a3c4614656b67eec61b5f9d',1,'std::locale::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a0ffbbf85c084d61ab49c7fec028bafba',1,'std::map::operator=(const map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a28b4c4feee2bbdf398540f4097d4bb91',1,'std::map::operator=(map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ac01f44f3ed4b9dbebcb046b4103f920c',1,'std::map::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac8928f66422bd3601fcf43b79761abd5',1,'std::mask_array::operator=(const mask_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2af95af73e734b394322ec304e1b73f2',1,'std::mask_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aaa530908380c41e867d3d3d8d6dcf017',1,'std::match_results::operator=(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a9066bb40864217bcf43710d9ea95bd86',1,'std::match_results::operator=(match_results &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#acd76a5f8a95e15654c8e61c55f1fdc61',1,'std::multimap::operator=(const multimap &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#aebc9eaf75029cfb33e4121a75a875713',1,'std::multimap::operator=(multimap &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a069fcb3baa5b568196b04950e380b865',1,'std::multimap::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a20d46cd310dd519085bca08a77ca0116',1,'std::multiset::operator=(const multiset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a572d0693c78910dc45ba3a5374066f7d',1,'std::multiset::operator=(multiset &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a92ec8ff818ef21f8d170842d4732299c',1,'std::multiset::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02635.html#adbefc6681906783e9e20249895a98082',1,'std::once_flag::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a3c5547f8d577192a0c4672ef08a1b166',1,'std::ostream_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#abcdedbb3c0f65a77d78cd15466ec7c73',1,'std::ostreambuf_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a86764099987b135d0966eda405b99de8',1,'std::regex_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a7701c80539dd9bb567d519151fe0484f',1,'std::regex_token_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a8ffd6bc39d7e301ec0f77568e4c531c2',1,'std::set::operator=(const set &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#afc8c71ffd02970fa13cd6f6fbd40682b',1,'std::set::operator=(set &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a8e269a4d9e589df1ef1bc6df659e7a96',1,'std::set::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga638dcc09b7202f5e671c6637bf01db31',1,'std::slice_array::operator=(const slice_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab5edb43da924e3c138ba22d29dc4c050',1,'std::slice_array::operator=(const valarray< _Tp > &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga3ddb6f583d7c7ef17b471662a4a7a7ac',1,'std::slice_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a0aa055c3e0b3e447ea378c5982952d20',1,'std::tr2::dynamic_bitset::operator=(const dynamic_bitset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a617447d4740d9204992d8119a838aff7',1,'std::tr2::dynamic_bitset::operator=(dynamic_bitset &&__b) noexcept(std::is_nothrow_move_assignable< _Base >::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'std::unique_ptr::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'std::unique_ptr::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'std::unique_ptr::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a6591772e73b9c09f47f348484995e811',1,'std::unique_ptr< _Tp[], _Dp >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#ac4e60274f821a367b846aaf799897792',1,'std::unique_ptr< _Tp[], _Dp >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#ac873de4914a9d9182497101f8c66ac10',1,'std::unique_ptr< _Tp[], _Dp >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aca0525353d274a1abca19e123ca58702',1,'std::unordered_map::operator=(const unordered_map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d63494d15ed6c47df072d06d9608ca0',1,'std::unordered_map::operator=(unordered_map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a46087d4d85698c13e7fe5e10f13821d1',1,'std::unordered_map::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a04b3ff006b08f143403c12e743ced9b6',1,'std::unordered_multimap::operator=(const unordered_multimap &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac9f4a7b990b045b2709562eb6b7f9328',1,'std::unordered_multimap::operator=(unordered_multimap &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a1dd84e27aa97a782f79e757eadcd5461',1,'std::unordered_multimap::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a9e17536caf4f009c1a337cbdc65b10e4',1,'std::unordered_multiset::operator=(const unordered_multiset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#abc404eb73cb8ffa4efb906fd400e476b',1,'std::unordered_multiset::operator=(unordered_multiset &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#adfc21fb29e21a666c726325bdbab7fd8',1,'std::unordered_multiset::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a28b4eb4e12733c87d05ecd05c23e4269',1,'std::unordered_set::operator=(const unordered_set &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae40948838a04772d6e2e0281ccbde1f3',1,'std::unordered_set::operator=(unordered_set &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a3c34d8e0d4bfc8c91c4b54b5199edc04',1,'std::unordered_set::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafd9682220fbb71cdd3780fb0b80a7840',1,'std::valarray::operator=(const valarray< _Tp > &__v)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0b40ea6b05b21b6506d3541205bbfe64',1,'std::valarray::operator=(valarray< _Tp > &&__v) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga80a24d05a21101fb1e8f32d7617b349a',1,'std::valarray::operator=(const _Tp &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga708c338c38f644c83fb4440add0a7f82',1,'std::valarray::operator=(const slice_array< _Tp > &__sa)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga975285295867516982cbd04e5416ca33',1,'std::valarray::operator=(const gslice_array< _Tp > &__ga)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga008f37655c6e6e55b37c9b46efd259c1',1,'std::valarray::operator=(const mask_array< _Tp > &__ma)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad58ef4619934cdeccb9b476c6e8ccceb',1,'std::valarray::operator=(const indirect_array< _Tp > &__ia)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga781c3cfba5752871b9b8df2717f3d301',1,'std::valarray::operator=(initializer_list< _Tp > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'std::vector::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'std::vector::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'std::vector::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Codecvt >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Codecvt >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Codecvt >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Res_type >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Res_type >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Res_type >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Result< _Res > >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Result< _Res > >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Result< _Res > >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Result_base >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Result_base >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Result_base >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< bool[]>::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< bool[]>::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< bool[]>::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aca0525353d274a1abca19e123ca58702',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator=(const unordered_map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d63494d15ed6c47df072d06d9608ca0',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator=(unordered_map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a46087d4d85698c13e7fe5e10f13821d1',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafd9682220fbb71cdd3780fb0b80a7840',1,'valarray< size_t >::operator=(const valarray< size_t > &__v)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0b40ea6b05b21b6506d3541205bbfe64',1,'valarray< size_t >::operator=(valarray< size_t > &&__v) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga80a24d05a21101fb1e8f32d7617b349a',1,'valarray< size_t >::operator=(const size_t &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga708c338c38f644c83fb4440add0a7f82',1,'valarray< size_t >::operator=(const slice_array< size_t > &__sa)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga975285295867516982cbd04e5416ca33',1,'valarray< size_t >::operator=(const gslice_array< size_t > &__ga)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga008f37655c6e6e55b37c9b46efd259c1',1,'valarray< size_t >::operator=(const mask_array< size_t > &__ma)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad58ef4619934cdeccb9b476c6e8ccceb',1,'valarray< size_t >::operator=(const indirect_array< size_t > &__ia)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga781c3cfba5752871b9b8df2717f3d301',1,'valarray< size_t >::operator=(initializer_list< size_t > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< __diff_type >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< __diff_type >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< __diff_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _CharClassT >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _CharClassT >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _CharClassT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _CharT >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _CharT >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _CharT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _Cmpt >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _Cmpt >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _Cmpt >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _Node *, _Nodeptr_Alloc >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _Node *, _Nodeptr_Alloc >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _Node *, _Nodeptr_Alloc >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _RealType >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _RealType >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _RealType >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _State< _TraitsT::char_type > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _State< _TraitsT::char_type > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _State< _TraitsT::char_type > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _StringT >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _StringT >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _StringT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< block_type, allocator_type >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< block_type, allocator_type >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< block_type, allocator_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< Catalog_info * >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< Catalog_info * >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< Catalog_info * >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< double >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< double >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< double >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< int >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< int >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< int >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< result_type >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< result_type >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< result_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< size_t >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< size_t >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< size_t >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< std::pair< _BiIter, int > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< std::pair< _BiIter, int > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< std::pair< _BiIter, int > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< std::pair< _StateIdT, std::vector > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< std::pair< _StateIdT, std::vector > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< std::pair< _StateIdT, std::vector > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< sub_match< _BiIter >, _Alloc >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< sub_match< _BiIter >, _Alloc >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< sub_match< _BiIter >, _Alloc >::operator=(initializer_list< value_type > __l)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a61747e22cfd8bd36456de2deed877fca',1,'Eigen::AngleAxis::operator=(const MatrixBase< Derived > &mat)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#aa79ba9655d1b8fe12d75082902cea88b',1,'Eigen::AngleAxis::operator=(const QuaternionBase< QuatDerived > &q)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Eigen::Array::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Eigen::Array::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Eigen::Array::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Eigen::Array::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< double, DPARM_SIZE, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< double, DPARM_SIZE, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< double, DPARM_SIZE, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< double, DPARM_SIZE, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< Index, 1, Dynamic >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< Index, 1, Dynamic >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< Index, 1, Dynamic >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< Index, 1, Dynamic >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< int, IPARM_SIZE, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< int, IPARM_SIZE, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< int, IPARM_SIZE, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< int, IPARM_SIZE, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< RealScalar, Dynamic, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< RealScalar, Dynamic, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< RealScalar, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< RealScalar, Dynamic, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< StorageIndex, 2, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< StorageIndex, 2, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< StorageIndex, 2, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< StorageIndex, 2, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a8587d8d893f5225a4511e9d76d9fe3cc',1,'Eigen::ArrayBase::operator=(const ArrayBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a80cacb05b6881fba659efb2377e4fd22',1,'Eigen::ArrayBase::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a8587d8d893f5225a4511e9d76d9fe3cc',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator=(const ArrayBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a80cacb05b6881fba659efb2377e4fd22',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'Eigen::DenseBase::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'Eigen::DenseBase::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'Eigen::DenseBase::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'DenseBase< Solve< Decomposition, RhsType > >::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'DenseBase< Solve< Decomposition, RhsType > >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'DenseBase< Solve< Decomposition, RhsType > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a5d362adc0550baabcff2095c92c5045d',1,'Eigen::DiagonalMatrix::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Eigen::Matrix::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Eigen::Matrix::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Eigen::Matrix::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< RealScalar, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< RealScalar, Dynamic, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< RealScalar, Dynamic, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, 3, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, 3, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, 3, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Dim, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Dim, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Dim, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Dynamic, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Dynamic, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< StorageIndex, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< StorageIndex, Dynamic, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< StorageIndex, Dynamic, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a373bf62ad398162df5a71963ed7cbeff',1,'Eigen::MatrixBase::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a373bf62ad398162df5a71963ed7cbeff',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a373bf62ad398162df5a71963ed7cbeff',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'Eigen::PermutationBase::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'Eigen::PermutationBase::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'Eigen::PermutationMatrix::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'Eigen::PermutationMatrix::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'Eigen::PlainObjectBase::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'Eigen::PlainObjectBase::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'Eigen::QuaternionBase::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'Eigen::QuaternionBase::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a9d3da523c37f4ef0574f35fd7b3b9662',1,'Eigen::Rotation2D::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolExpr.html#a0bd43167911dc398fba4e3f0f142a64d',1,'Eigen::symbolic::SymbolExpr::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a826047489741a19b81c6552f8257b1cf',1,'Eigen::Transform::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a8ed8318285ccc7498197da7df1273bd5',1,'Eigen::Transform::operator=(const QMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a54986164dcb1d0f7bfa216b8ef5272f6',1,'Eigen::Transform::operator=(const QTransform &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a991cbd0dcd647b414bbfdbacb642dbbd',1,'Eigen::Transpositions::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a991cbd0dcd647b414bbfdbacb642dbbd',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a09db8ccbd4b2da7c7e8d520458166cc1',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator=(const MatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a556c7e90c64e86a3a8e722989dda1bc6',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator=(const TriangularBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'Eigen::VectorwiseOp::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Derived, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Derived, Vertical >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a1ae937c299f347a9dcb7f31a8e57762b.html#a1ae937c299f347a9dcb7f31a8e57762b',1,'nlohmann::basic_json::operator=()'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a1a90dae111cf189ac9ad340a60b199b6.html#a1a90dae111cf189ac9ad340a60b199b6',1,'nlohmann::json_sax::operator=(const json_sax &)=default'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_ac74584e3dc41f2465e69b37d7d2bf694.html#ac74584e3dc41f2465e69b37d7d2bf694',1,'nlohmann::json_sax::operator=(json_sax &&) noexcept=default'],['../classcam_1_1CameraParams.html#a7a73a289f11757797b23d816e2561dae',1,'cam::CameraParams::operator=()'],['../classrobot_1_1base__motor.html#a354ebc41c91a7f98c7b3b8cf8bfd145f',1,'robot::base_motor::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9451cdb3a66bebcc1f5e8b409f780b7f',1,'operator=(const softfloat &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf80704eb7bfc3257da30ad5a82fb9de',1,'operator=(const softdouble &c)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga92ff752125c60794c33d55db59b48105',1,'operator=(const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaebc147a1a3a6e326215cd323aafa6bc6',1,'operator=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf25507c9a66f729500964d397b7cb9fb',1,'operator=(const gslice_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga73cce032d98e922eeafb676920174f52',1,'operator=(const indirect_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac8928f66422bd3601fcf43b79761abd5',1,'operator=(const mask_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf2a0c3883cfb758e05e3d62ec7e0a07f',1,'operator=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga59fd646ebf243e99b2063baf37ba91d0',1,'operator=(const gslice &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8dfed8c043d7a82e4b71cf65c64ec844',1,'operator=(const _Tp &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga638dcc09b7202f5e671c6637bf01db31',1,'operator=(const slice_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0b40ea6b05b21b6506d3541205bbfe64',1,'operator=(valarray< _Tp > &&__v) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga708c338c38f644c83fb4440add0a7f82',1,'operator=(const slice_array< _Tp > &__sa)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga975285295867516982cbd04e5416ca33',1,'operator=(const gslice_array< _Tp > &__ga)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga008f37655c6e6e55b37c9b46efd259c1',1,'operator=(const mask_array< _Tp > &__ma)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad58ef4619934cdeccb9b476c6e8ccceb',1,'operator=(const indirect_array< _Tp > &__ia)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga781c3cfba5752871b9b8df2717f3d301',1,'operator=(initializer_list< _Tp > __l)(Global Namespace)']]], - ['operator_3d_3d_123',['operator==',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#acf112fc545f9775e075edc49aba223c4',1,'cv::FileNodeIterator::operator==(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#acf112fc545f9775e075edc49aba223c4',1,'cv::FileNodeIterator::operator==(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/dd5/structcv_1_1GArrayDesc.html#aa68591702df8e965af25f67215b9a025',1,'cv::GArrayDesc::operator==()'],['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html#aa6626bdd5f1f55a5f29bad91cf8b891b',1,'cv::gapi::GBackend::operator==()'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a15c5b7fd785e239a1863f4658c1c53ac',1,'cv::GMatDesc::operator==()'],['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#a1f2bff8899fd6b72e574d48194bf283b',1,'cv::optflow::GPCTree::operator==()'],['https://docs.opencv.org/4.2.0/d1/d6a/structcv_1_1GScalarDesc.html#a36bdb1c38855e657126b600da4befb61',1,'cv::GScalarDesc::operator==()'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a90841129d2fa56dc7713e51d668dd8b5',1,'cv::linemod::Match::operator==()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0f25efd0c1f254692fc60bda5f4c3353',1,'cv::MatExpr::operator==(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5516de530ce49cf1fdbfcedbc13fa64d',1,'cv::MatExpr::operator==(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2c23e8205bea3a64497638fe270e3a83',1,'cv::MatExpr::operator==(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab9e92650570e38003f74364c0d168157',1,'cv::MatExpr::operator==(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abb139508b5df77d1009612b438f53df5',1,'cv::MatExpr::operator==(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0f25efd0c1f254692fc60bda5f4c3353',1,'cv::MatExpr::operator==(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5516de530ce49cf1fdbfcedbc13fa64d',1,'cv::MatExpr::operator==(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2c23e8205bea3a64497638fe270e3a83',1,'cv::MatExpr::operator==(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab9e92650570e38003f74364c0d168157',1,'cv::MatExpr::operator==(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abb139508b5df77d1009612b438f53df5',1,'cv::MatExpr::operator==(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#ae19097bf50bc486e072f340a295adb64',1,'cv::MatSize::operator==()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'cv::Matx::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'cv::Matx::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< _Tp, cn, 1 >::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< _Tp, cn, 1 >::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 1, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 1, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 2 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 2 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 4, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 4, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, cn, 1 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, cn, 1 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 2, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 2, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 3, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 3, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, cn, 1 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, cn, 1 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float_type, 4, 4 >::operator==(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float_type, 4, 4 >::operator==(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/d8/dde/structNcvSize32u.html#a447699c291cd1eb0786f1ee3b1570fb6',1,'NcvSize32u::operator==()'],['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#a30538c00fc6f3108318e8dea59aca435',1,'cv::optflow::GPCTree::Node::operator==()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a6c4889ee703a2b667df1fa298ffa312f',1,'cv::RNG::operator==()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga972dee821ab26d61f11528b427131083',1,'cv::softdouble::operator==()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf9ae987f5788edbe1aada59dd7f41717',1,'cv::softfloat::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7acc944a17c34a7e6a1f46a18319abe7',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7acc944a17c34a7e6a1f46a18319abe7',1,'__gnu_pbds::detail::bin_search_tree_node_it_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#a49be997a654cf31a5688f876b3a0926b',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator==(const binary_heap_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a086ba257226b242633bc6519023da110',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator==(const binary_heap_point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a086ba257226b242633bc6519023da110',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#ae75829a8ccd781a3914acd4e19e3ce3e',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator==(const left_child_next_sibling_heap_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a0a47dab89d7acfb414046e40887e3064',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator==(const left_child_next_sibling_heap_node_point_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a0a47dab89d7acfb414046e40887e3064',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a46409e64d8adbfd9be6a641313d150da',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a46409e64d8adbfd9be6a641313d150da',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a71de2ddc1c6ba25e6e272c9da3a95318',1,'const_iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a866b2f6450ebeaa95ed1b6065451ad7d',1,'const_iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a71de2ddc1c6ba25e6e272c9da3a95318',1,'iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a866b2f6450ebeaa95ed1b6065451ad7d',1,'iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a71de2ddc1c6ba25e6e272c9da3a95318',1,'point_const_iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a866b2f6450ebeaa95ed1b6065451ad7d',1,'point_const_iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#adfa598f9d27ae43c69743fa39fd49a05',1,'point_iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#aa326cdd6985b3c513e13027a420cc8d8',1,'point_iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#affef282a5c1dde27d67a3ad667936c17',1,'std::bitset::operator==(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#affef282a5c1dde27d67a3ad667936c17',1,'std::bitset::operator==(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a0f58972cf0b98da7d1e751bba3f28f7e',1,'std::locale::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#adb0c9c95d8d972b0f68da2b1740bbc14',1,'std::regex_iterator::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a075cbb0e00f38573d223b5590ac9c438',1,'std::regex_token_iterator::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a80e3e1e83fdf43f9f7fb6ff51836b24d',1,'Eigen::MatrixBase::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a80e3e1e83fdf43f9f7fb6ff51836b24d',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a80e3e1e83fdf43f9f7fb6ff51836b24d',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'Eigen::QuaternionBase::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator==()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_aee67fde9d3d571a07d5bb35df21c0555.html#aee67fde9d3d571a07d5bb35df21c0555',1,'nlohmann::byte_container_with_subtype::operator==()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga265437a0b1f89bf8f23abfc7a4851fe7',1,'cv::operator==()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ef7d0ea1a3ab83c7f256519308a844',1,'cv::cudev::operator==(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c03cd29116a3881ded8063f7b2ba14f',1,'cv::cudev::operator==(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f3a2eceff62c03cd9a882415b1c3f0',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a4d2f075d535c3ff86c0b6bf318e72',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c672631285cf71d4d1d4dbe0efce11f',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4251ba200887d1621e3666dab16287ab',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa06c320c4bd4a2b17768c4139c1a6293',1,'cv::cudev::operator==(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga528b1ebd894984f8761e8b8d88032fa7',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga911a544f2ecd6917b6b4e401bee9d8a5',1,'cv::cudev::operator==(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5dae5116c781ee0064d66d54eb3156d',1,'cv::cudev::operator==(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabc05ae0491425089c125d9df1d4cf71',1,'cv::cudev::operator==(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e265e4d4ec9c9ea2d10b024fa2ad5d5',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3176752b40d5162d7960321c5862a1a',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88f39c819d520a99b1e101b22de693ce',1,'cv::cudev::operator==(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf424cb9b34f4e8037d63be9ac57eacb8',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42690ed246813e13156ee7a94a6edfb8',1,'cv::cudev::operator==(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c2d540d34347146ca6fd7fc13362f18',1,'cv::cudev::operator==(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca47f7f9407e6fd8424aebc82a811283',1,'cv::cudev::operator==(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf63eee75bc9dfcd335ee6100a0ab2b6',1,'cv::cudev::operator==(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d000c2d62a0a2feb023cfce8912b2ef',1,'cv::cudev::operator==(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7b6cc4a40099563d92a21677659e0',1,'cv::cudev::operator==(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10206e51eb5cf79fc73525e83b18b74a',1,'cv::cudev::operator==(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3fb8521b5e67d3ff9ab4a7e1afad12',1,'cv::cudev::operator==(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fc754b6f5b8565f33507efb2275bfb6',1,'cv::cudev::operator==(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be39f600250879de5101123b66504b8',1,'cv::cudev::operator==(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfb79324be9e683545bb7002bc4ab28',1,'cv::cudev::operator==(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ee6639a7f89d8f34c3c6ef3612549c1',1,'cv::cudev::operator==(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4f48f70be081aacfd902bedf1e51fe',1,'cv::cudev::operator==(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c4da213e91b805e976aa524c708c00',1,'cv::cudev::operator==(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56c8ff40e1386ced3569766a16d8d4f',1,'cv::cudev::operator==(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7fd7e441fa19fc3d30891d4a72dd3d',1,'cv::cudev::operator==(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05bbbea75bff44d625777a0f747fa3d8',1,'cv::cudev::operator==(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga792515f0fb51d1d5ec3909796ca83210',1,'cv::cudev::operator==(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b07bce720a1685cb83bf8f41013a25f',1,'cv::cudev::operator==(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18dff9db2290860f6cc90b61deaa1b30',1,'cv::cudev::operator==(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b545fa1278af6ad8c1d637d3177eb10',1,'cv::cudev::operator==(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d099a82124c0e33bdcc5d5e74eaebb2',1,'cv::cudev::operator==(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6783ef41308862477ba5314de3e69d0',1,'cv::cudev::operator==(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4ed94a65ade2bd611d9abb6706e4a2c',1,'cv::cudev::operator==(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac651885fe279e2497a477cbfc1ede96f',1,'cv::cudev::operator==(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2039c53f02ea2409638a50ef3c6be3e',1,'cv::cudev::operator==(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga896fedd904924b35b5d2afcae58f3a0c',1,'cv::cudev::operator==(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cac30ae19e5ed19d98562f0dab48191',1,'cv::cudev::operator==(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeda02a903e1895363cf991717900cd5c',1,'cv::cudev::operator==(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35df58b1d78944360c0d0a1f79eaf903',1,'cv::cudev::operator==(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba49598153961051c9ddf282d36acf2',1,'cv::cudev::operator==(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dd4f1bc3a106a0ae0c8a202dc9b289e',1,'cv::cudev::operator==(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08afcea4414c4e8448351d208645e1d2',1,'cv::cudev::operator==(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa536847ec326ee826054043706320926',1,'cv::cudev::operator==(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1858de8e86a7d74dd5696a3da6622f00',1,'cv::cudev::operator==(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d443a79fa65df214fb74a750765eb33',1,'cv::cudev::operator==(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101069df9b8c98db50d7723eb2452905',1,'cv::cudev::operator==(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f964ff73b6a52ccbeef211ae1202c8',1,'cv::cudev::operator==(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52ca12e909e8009d33d169cc954eb8e6',1,'cv::cudev::operator==(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b6072969257533c8b1c24ae3a35c9a1',1,'cv::cudev::operator==(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59cdc36df6f9053bc413dd3a92522ba3',1,'cv::cudev::operator==(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga666c44211474c9a295525bca03433cee',1,'cv::cudev::operator==(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaea9ab37e1f2dd66c45b3283de613cbd',1,'cv::cudev::operator==(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56b745a12912d7e0b7ae22fd6297902',1,'cv::cudev::operator==(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e9304361fccde39db1ab2ae0c07f68',1,'cv::cudev::operator==(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec3b2bf74cd4ff6af94bb83bdf8783b4',1,'cv::cudev::operator==(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga128ceaedc10a626785f8ce09f554198a',1,'cv::cudev::operator==(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81f8f4793ee7c514eca370438997eb45',1,'cv::cudev::operator==(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1329e50637b7b5ac07100d3e263331d',1,'cv::cudev::operator==(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78683b47cb3562be1f4d48606497e409',1,'cv::cudev::operator==(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa32ae379c00e669b968b3090cd815e2a',1,'cv::cudev::operator==(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29a49819fa81a12fdb40418ecfed5085',1,'cv::cudev::operator==(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f3770d45d2f2184aefca17515d82fc8',1,'cv::cudev::operator==(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36065bc2f0c37455244db7f412296a59',1,'cv::cudev::operator==(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1c6ff78a4c2957eb469cce1e0d9892b',1,'cv::cudev::operator==(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24b60bc88c8796c3b7d230868e9d1e65',1,'cv::cudev::operator==(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0cf450da39a02ef534f92365e71eef9',1,'cv::cudev::operator==(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d7fcd75c972fae50f91d56bd0f815a',1,'cv::cudev::operator==(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dcbfffb2623cdd808a82387de219fdb',1,'cv::cudev::operator==(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76e79f2930fab6ae0c14b89445494a83',1,'cv::cudev::operator==(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3cb39b62df9f3c283aa768412fda24bc',1,'cv::cudev::operator==(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4940b8cdca244cec798fc5e12b96ed8e',1,'cv::cudev::operator==(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c906fac8d8e04f4c1b62ba525fd1617',1,'cv::cudev::operator==(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12c2c61f6d87749a497db6cb678835db',1,'cv::cudev::operator==(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd318fb104522620d4d12b98b93c8974',1,'cv::cudev::operator==(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff38bcfdc1dca4e5abfac0ca3b117fc',1,'cv::cudev::operator==(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ba83f60df077bb1b5654a2ee1afb367',1,'cv::cudev::operator==(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ec516b24d0b6b66b6419089b9bc0713',1,'cv::cudev::operator==(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c31130c36dc9b842e26fdaf680e00b6',1,'cv::cudev::operator==(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b31d6c71170412cae5061aa6ac19442',1,'cv::cudev::operator==(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecc2ba37fea0d1d795a2cab8ece45cc1',1,'cv::cudev::operator==(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e7ea06c654354b984128255037d55fd',1,'cv::cudev::operator==(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf30eab4cac32df44e33444bfe7b0070',1,'cv::cudev::operator==(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb69979b7b37bfd566ca1ab2da349c98',1,'cv::cudev::operator==(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7697781422bbb9de18a582f93388324c',1,'cv::cudev::operator==(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46152b0d4aabffb4ca701da3b541068b',1,'cv::cudev::operator==(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6fbc5b8438fe5bea85238b9d0c5f3e',1,'cv::cudev::operator==(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade08fcc308b2e20d50c4a3438fe4b6ee',1,'cv::cudev::operator==(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae34b2a72fe4150e858465a7769ee2c52',1,'cv::cudev::operator==(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0c0ceb6055acb375303cecd49634749',1,'cv::cudev::operator==(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3eff50212ed2892cd6fe4b8d19dd3a2a',1,'cv::cudev::operator==(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga853c4c648ea2ed3ba048ed254fa6f394',1,'cv::cudev::operator==(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96ad2da041f97e4dc0ea14e0da62fe96',1,'cv::cudev::operator==(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5346316989e032dda02d05565286aba1',1,'cv::cudev::operator==(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80fad755179790ebd605e94301d180ef',1,'cv::cudev::operator==(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3123a45c875b4eb9a41975aa969b6db5',1,'cv::cudev::operator==(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63e43865abdcf4a38d39a5eb89729f63',1,'cv::cudev::operator==(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5a0f9e14535efa9de7e727cef2f9bcd',1,'cv::cudev::operator==(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa49d3faa449c6996a36b4cfe9bc746e7',1,'cv::cudev::operator==(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89677a515b08e742fc50a35d1798fc03',1,'cv::cudev::operator==(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9447ed9200cf81281050367c324bdf10',1,'cv::cudev::operator==(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabee6ab2431bb58230e98a0ede9c6d337',1,'cv::cudev::operator==(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42afbc516bbfa01e1310a9bab908702',1,'cv::cudev::operator==(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0a74127fa51af116df67364acd93bd3',1,'cv::cudev::operator==(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e730bd659adc74654d92449dad36b9d',1,'cv::cudev::operator==(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga346d65131b0e3c9e3ac61de5176606a8',1,'cv::cudev::operator==(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa30c0df3a7b04d70749c2ab8b6fff5fe',1,'cv::cudev::operator==(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec539fea1d620f685a11e9d391f78afd',1,'cv::cudev::operator==(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b435363def80bdc86a9841a802a2ca',1,'cv::cudev::operator==(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1153ecbaadb6527bf4913cc87d984850',1,'cv::cudev::operator==(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9127ac6fce50f851f7d47463fa632fbf',1,'cv::cudev::operator==(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga612438c13d01ed44d78967a7febf0eb0',1,'cv::cudev::operator==(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00a17f5eee9ac60ccb1ababf1fd1e73b',1,'cv::cudev::operator==(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd8701578ccdf15bc6cbb4d3d5517c9',1,'cv::cudev::operator==(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2bb15eb31a7a24d0434a3a131d06d8',1,'cv::cudev::operator==(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/d0/d1a/namespacecv_1_1gapi_1_1fluid.html#a10b8ba4730d3e056eb20a3ec7b1cee96',1,'cv::gapi::fluid::operator==()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#adc6dd73da3e9d530ba62bb4de813ce59',1,'cv::gapi::own::operator==(const Scalar &lhs, const Scalar &rhs)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a67f8ec451661ed549feca91a814d84e9',1,'cv::gapi::own::operator==(const Rect &lhs, const Rect &rhs)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#aa2f43bcd90b89230eadc4556a534cf0d',1,'cv::gapi::own::operator==(const Size &lhs, const Size &rhs)'],['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a3025fa7e3d6892a5ee2144bf3b564c22',1,'cv::instr::operator==()'],['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#ad1e6cef1a8e7e7dbed38321d38691c9d',1,'cv::tbm::operator==()'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a4d75335a7cc12c0d62a854c9151e02d2',1,'cv::util::operator==(const util::monostate &, const util::monostate &)'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a671a36e09de46881212b09f980d86b00',1,'cv::util::operator==(const variant< Us... > &lhs, const variant< Us... > &rhs)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf9ae987f5788edbe1aada59dd7f41717',1,'operator==(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga972dee821ab26d61f11528b427131083',1,'operator==(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga265437a0b1f89bf8f23abfc7a4851fe7',1,'operator==(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ef7d0ea1a3ab83c7f256519308a844',1,'operator==(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c03cd29116a3881ded8063f7b2ba14f',1,'operator==(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f3a2eceff62c03cd9a882415b1c3f0',1,'operator==(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a4d2f075d535c3ff86c0b6bf318e72',1,'operator==(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c672631285cf71d4d1d4dbe0efce11f',1,'operator==(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4251ba200887d1621e3666dab16287ab',1,'operator==(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa06c320c4bd4a2b17768c4139c1a6293',1,'operator==(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga528b1ebd894984f8761e8b8d88032fa7',1,'operator==(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga911a544f2ecd6917b6b4e401bee9d8a5',1,'operator==(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5dae5116c781ee0064d66d54eb3156d',1,'operator==(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabc05ae0491425089c125d9df1d4cf71',1,'operator==(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e265e4d4ec9c9ea2d10b024fa2ad5d5',1,'operator==(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3176752b40d5162d7960321c5862a1a',1,'operator==(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88f39c819d520a99b1e101b22de693ce',1,'operator==(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf424cb9b34f4e8037d63be9ac57eacb8',1,'operator==(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42690ed246813e13156ee7a94a6edfb8',1,'operator==(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c2d540d34347146ca6fd7fc13362f18',1,'operator==(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca47f7f9407e6fd8424aebc82a811283',1,'operator==(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf63eee75bc9dfcd335ee6100a0ab2b6',1,'operator==(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d000c2d62a0a2feb023cfce8912b2ef',1,'operator==(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7b6cc4a40099563d92a21677659e0',1,'operator==(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10206e51eb5cf79fc73525e83b18b74a',1,'operator==(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3fb8521b5e67d3ff9ab4a7e1afad12',1,'operator==(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fc754b6f5b8565f33507efb2275bfb6',1,'operator==(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be39f600250879de5101123b66504b8',1,'operator==(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfb79324be9e683545bb7002bc4ab28',1,'operator==(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ee6639a7f89d8f34c3c6ef3612549c1',1,'operator==(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4f48f70be081aacfd902bedf1e51fe',1,'operator==(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c4da213e91b805e976aa524c708c00',1,'operator==(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56c8ff40e1386ced3569766a16d8d4f',1,'operator==(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7fd7e441fa19fc3d30891d4a72dd3d',1,'operator==(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05bbbea75bff44d625777a0f747fa3d8',1,'operator==(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga792515f0fb51d1d5ec3909796ca83210',1,'operator==(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b07bce720a1685cb83bf8f41013a25f',1,'operator==(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18dff9db2290860f6cc90b61deaa1b30',1,'operator==(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b545fa1278af6ad8c1d637d3177eb10',1,'operator==(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d099a82124c0e33bdcc5d5e74eaebb2',1,'operator==(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6783ef41308862477ba5314de3e69d0',1,'operator==(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4ed94a65ade2bd611d9abb6706e4a2c',1,'operator==(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac651885fe279e2497a477cbfc1ede96f',1,'operator==(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2039c53f02ea2409638a50ef3c6be3e',1,'operator==(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga896fedd904924b35b5d2afcae58f3a0c',1,'operator==(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cac30ae19e5ed19d98562f0dab48191',1,'operator==(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeda02a903e1895363cf991717900cd5c',1,'operator==(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35df58b1d78944360c0d0a1f79eaf903',1,'operator==(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba49598153961051c9ddf282d36acf2',1,'operator==(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dd4f1bc3a106a0ae0c8a202dc9b289e',1,'operator==(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08afcea4414c4e8448351d208645e1d2',1,'operator==(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa536847ec326ee826054043706320926',1,'operator==(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1858de8e86a7d74dd5696a3da6622f00',1,'operator==(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d443a79fa65df214fb74a750765eb33',1,'operator==(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101069df9b8c98db50d7723eb2452905',1,'operator==(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f964ff73b6a52ccbeef211ae1202c8',1,'operator==(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52ca12e909e8009d33d169cc954eb8e6',1,'operator==(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b6072969257533c8b1c24ae3a35c9a1',1,'operator==(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59cdc36df6f9053bc413dd3a92522ba3',1,'operator==(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga666c44211474c9a295525bca03433cee',1,'operator==(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaea9ab37e1f2dd66c45b3283de613cbd',1,'operator==(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56b745a12912d7e0b7ae22fd6297902',1,'operator==(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e9304361fccde39db1ab2ae0c07f68',1,'operator==(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec3b2bf74cd4ff6af94bb83bdf8783b4',1,'operator==(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga128ceaedc10a626785f8ce09f554198a',1,'operator==(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81f8f4793ee7c514eca370438997eb45',1,'operator==(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1329e50637b7b5ac07100d3e263331d',1,'operator==(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78683b47cb3562be1f4d48606497e409',1,'operator==(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa32ae379c00e669b968b3090cd815e2a',1,'operator==(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29a49819fa81a12fdb40418ecfed5085',1,'operator==(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f3770d45d2f2184aefca17515d82fc8',1,'operator==(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36065bc2f0c37455244db7f412296a59',1,'operator==(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1c6ff78a4c2957eb469cce1e0d9892b',1,'operator==(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24b60bc88c8796c3b7d230868e9d1e65',1,'operator==(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0cf450da39a02ef534f92365e71eef9',1,'operator==(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d7fcd75c972fae50f91d56bd0f815a',1,'operator==(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dcbfffb2623cdd808a82387de219fdb',1,'operator==(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76e79f2930fab6ae0c14b89445494a83',1,'operator==(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3cb39b62df9f3c283aa768412fda24bc',1,'operator==(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4940b8cdca244cec798fc5e12b96ed8e',1,'operator==(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c906fac8d8e04f4c1b62ba525fd1617',1,'operator==(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12c2c61f6d87749a497db6cb678835db',1,'operator==(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd318fb104522620d4d12b98b93c8974',1,'operator==(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff38bcfdc1dca4e5abfac0ca3b117fc',1,'operator==(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ba83f60df077bb1b5654a2ee1afb367',1,'operator==(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ec516b24d0b6b66b6419089b9bc0713',1,'operator==(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c31130c36dc9b842e26fdaf680e00b6',1,'operator==(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b31d6c71170412cae5061aa6ac19442',1,'operator==(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecc2ba37fea0d1d795a2cab8ece45cc1',1,'operator==(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e7ea06c654354b984128255037d55fd',1,'operator==(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf30eab4cac32df44e33444bfe7b0070',1,'operator==(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb69979b7b37bfd566ca1ab2da349c98',1,'operator==(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7697781422bbb9de18a582f93388324c',1,'operator==(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46152b0d4aabffb4ca701da3b541068b',1,'operator==(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6fbc5b8438fe5bea85238b9d0c5f3e',1,'operator==(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade08fcc308b2e20d50c4a3438fe4b6ee',1,'operator==(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae34b2a72fe4150e858465a7769ee2c52',1,'operator==(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0c0ceb6055acb375303cecd49634749',1,'operator==(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3eff50212ed2892cd6fe4b8d19dd3a2a',1,'operator==(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga853c4c648ea2ed3ba048ed254fa6f394',1,'operator==(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96ad2da041f97e4dc0ea14e0da62fe96',1,'operator==(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5346316989e032dda02d05565286aba1',1,'operator==(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80fad755179790ebd605e94301d180ef',1,'operator==(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3123a45c875b4eb9a41975aa969b6db5',1,'operator==(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63e43865abdcf4a38d39a5eb89729f63',1,'operator==(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5a0f9e14535efa9de7e727cef2f9bcd',1,'operator==(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa49d3faa449c6996a36b4cfe9bc746e7',1,'operator==(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89677a515b08e742fc50a35d1798fc03',1,'operator==(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9447ed9200cf81281050367c324bdf10',1,'operator==(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabee6ab2431bb58230e98a0ede9c6d337',1,'operator==(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42afbc516bbfa01e1310a9bab908702',1,'operator==(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0a74127fa51af116df67364acd93bd3',1,'operator==(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e730bd659adc74654d92449dad36b9d',1,'operator==(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga346d65131b0e3c9e3ac61de5176606a8',1,'operator==(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa30c0df3a7b04d70749c2ab8b6fff5fe',1,'operator==(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec539fea1d620f685a11e9d391f78afd',1,'operator==(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b435363def80bdc86a9841a802a2ca',1,'operator==(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1153ecbaadb6527bf4913cc87d984850',1,'operator==(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9127ac6fce50f851f7d47463fa632fbf',1,'operator==(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga612438c13d01ed44d78967a7febf0eb0',1,'operator==(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00a17f5eee9ac60ccb1ababf1fd1e73b',1,'operator==(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd8701578ccdf15bc6cbb4d3d5517c9',1,'operator==(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2bb15eb31a7a24d0434a3a131d06d8',1,'operator==(double s, const double1 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ae7f71d536da5bf14e2d75305b4b88da5',1,'__gnu_cxx::operator==(const _Pointer_adapter< _Tp > &__lhs, const _Pointer_adapter< _Tp > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#acbaf9ba3f0e9c26a8239a313ad714fa8',1,'__gnu_cxx::operator==(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ad0ff7d116cd8134193d3d843552d750c',1,'__gnu_cxx::operator==(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a20ca06133e85c3a0ea49857488a5b94c',1,'__gnu_cxx::operator==(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga0431ac39f84ec7f88d6bdb9db72bd5b9',1,'std::operator==(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a50d898f211d37c5a47907f462b0b17f1',1,'std::operator==(const fpos< _StateT > &__lhs, const fpos< _StateT > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a05fbef1e7e15558f5933ed15a339e97d',1,'std::operator==(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#gaadf1270d8fcc1bdae9a699e3d85c7986',1,'std::operator==(const reverse_iterator< _Iterator > &__x, const reverse_iterator< _Iterator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7aeb223367d887a2b7f358a50e15e6f2',1,'std::operator==(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga5559f33b5ba6dbf83e961888d324dd40',1,'std::operator==(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad2629e7ee31ca36d6d593639e698db6b',1,'std::operator==(const function< _Res(_Args...)> &__f, nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a225870d9721816ebaa535af4e19d0cc1',1,'std::operator==(nullptr_t, const function< _Res(_Args...)> &__f) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ada60c841e9fe08814304ae79d35267de',1,'std::operator==(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aeed20ec23d92debc5bd1a0c0ee6c1b52',1,'std::operator==(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga89f3784efc6a944b4857408f1fcf7f3b',1,'std::operator==(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga811c7e6a67b83ef003e899c4ea93b910',1,'std::operator==(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d6c242794f6d1866eb9cc58678ce8b1',1,'std::operator==(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae583f778cadadef72db1f8afaa7bc4a1',1,'std::operator==(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga472d58de0896c76b3d402dbf27aa75c8',1,'std::operator==(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae4390d0b1712ee5334c61da6e0576d08',1,'std::operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga51b1c9a2beb5254d11c13dbc22a8e379',1,'std::operator==(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ada41d3682184f0d0d8525907fdfcbea8',1,'std::operator==(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2cc59dba70d0427b9e006411b37aee81',1,'std::operator==(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaac6078c1098e92d740d6d226f1c5e3dd',1,'std::operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa823b88deb57ba1b2494ea0dbcc028a8',1,'std::operator==(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa2053d06d62313a4cde70f0f1d1f04c0',1,'std::operator==(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafcc9a7386753edf6a626ce090f9d4cd3',1,'std::operator==(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a60c2de42339c226dbeaeb60ef54b7bd2',1,'std::operator==(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a648834d2b253af7787093fe9156662f5',1,'std::operator==(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aecebb49b7915414fe7fd3eaff7c8516c',1,'std::operator==(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4edac9ce553e84f7c97c02172d93424e',1,'std::operator==(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaca932655bd64e8b079c145921e0d1d62',1,'std::operator==(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5bbecf180e08f24cdb60411af07873be',1,'std::operator==(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga8ce82b2067ebaf21931151dfee549f0d',1,'std::operator==(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaca932655bd64e8b079c145921e0d1d62',1,'operator==(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5bbecf180e08f24cdb60411af07873be',1,'operator==(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga8ce82b2067ebaf21931151dfee549f0d',1,'operator==(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga0431ac39f84ec7f88d6bdb9db72bd5b9',1,'operator==(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#gaadf1270d8fcc1bdae9a699e3d85c7986',1,'operator==(const reverse_iterator< _Iterator > &__x, const reverse_iterator< _Iterator > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga89f3784efc6a944b4857408f1fcf7f3b',1,'operator==(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga811c7e6a67b83ef003e899c4ea93b910',1,'operator==(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae583f778cadadef72db1f8afaa7bc4a1',1,'operator==(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga472d58de0896c76b3d402dbf27aa75c8',1,'operator==(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae4390d0b1712ee5334c61da6e0576d08',1,'operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga51b1c9a2beb5254d11c13dbc22a8e379',1,'operator==(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaac6078c1098e92d740d6d226f1c5e3dd',1,'operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafcc9a7386753edf6a626ce090f9d4cd3',1,'operator==(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga5559f33b5ba6dbf83e961888d324dd40',1,'operator==(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], - ['operator_3e_124',['operator>',['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html#a02573cd46ba9f4cf2fa8e7b40cde41df',1,'cv::detail::GraphEdge::operator>()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a85401ad9773e0afda99ae87137f26b6d',1,'cv::MatExpr::operator>(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae14822d723b02a44dcc6b9dc66b9d2d6',1,'cv::MatExpr::operator>(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#affc3d68c3891df1237e9a9bd96856c8c',1,'cv::MatExpr::operator>(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a35767a6160d961e75fbc3613e1b9f0a5',1,'cv::MatExpr::operator>(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a28ec289f14a0c25c6e9d1a596318ede3',1,'cv::MatExpr::operator>(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a85401ad9773e0afda99ae87137f26b6d',1,'cv::MatExpr::operator>(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae14822d723b02a44dcc6b9dc66b9d2d6',1,'cv::MatExpr::operator>(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#affc3d68c3891df1237e9a9bd96856c8c',1,'cv::MatExpr::operator>(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a35767a6160d961e75fbc3613e1b9f0a5',1,'cv::MatExpr::operator>(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a28ec289f14a0c25c6e9d1a596318ede3',1,'cv::MatExpr::operator>(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga89a6048ae27277f5f84458078a447a7b',1,'cv::softdouble::operator>()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9e6bd3f5911bf05d858b143d76813b13',1,'cv::softfloat::operator>()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga53b1ef03655e02eabf49238a5927f384',1,'cv::operator>()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf76a5cbe9661c03341fed10338283b3a',1,'cv::cudev::operator>(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35b979bc99aa0c19b8b03d0191c0aef',1,'cv::cudev::operator>(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fe6218c267adf7bf750b607bcee1dde',1,'cv::cudev::operator>(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557a3a12df84d433097b5f1df0d7d04',1,'cv::cudev::operator>(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga192ad383159b69ca2292f072b38508f9',1,'cv::cudev::operator>(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd71f8794eb458670da81e6e31ebd40d',1,'cv::cudev::operator>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga805cfea7bfd59489c103d6ea068e5dd8',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga876bfb5116ae02ad4707fb201477a535',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58c9c31838a279487423f7f3582c4913',1,'cv::cudev::operator>(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c5037a273d23375d3020863519e7732',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81c1cf50caa6fdfec4decace6bfacbff',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9020160028347e36054f9780e546ad2',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09090c1f87b4fcc6c50a59befc7b7d1',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5762932e36ee52fdf93dc9af9a9ae5f',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga631a8e54c62472f3efd66b05c220ac99',1,'cv::cudev::operator>(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ca5edb7aebb689a224b13a06da7c096',1,'cv::cudev::operator>(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92f4356bcda49befcae07fe5897806ef',1,'cv::cudev::operator>(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga462d276943a4befba6bd1e5f7597ab43',1,'cv::cudev::operator>(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab987b25924d83dcbbb586e8c82b54457',1,'cv::cudev::operator>(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab42431af22ff2b15ff34bc2ca158d648',1,'cv::cudev::operator>(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ecf652b96c5cf329f62e04e798c7938',1,'cv::cudev::operator>(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6181bf9f0fc217c2fa0062df7dd997',1,'cv::cudev::operator>(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78139b6caee2bfff7f7e416fd4c0fa86',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33f4d71b881eec12c81fa08710e13b90',1,'cv::cudev::operator>(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa24e4c795c4f9dff281f74e4a49517',1,'cv::cudev::operator>(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga979bbc65c1aa9cb961473faeec0c001d',1,'cv::cudev::operator>(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga763bba01a3388aa4241f24b934a36b9e',1,'cv::cudev::operator>(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a322f89d75c39df09b42d571cde02c',1,'cv::cudev::operator>(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadea03e1ebb6998d08fe7e356fc675da4',1,'cv::cudev::operator>(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfd53947e82410ed70ef8af8e469be95',1,'cv::cudev::operator>(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00fc760015647c4518fc1c250b34f3a0',1,'cv::cudev::operator>(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aac1815665d44067eae7d8cb4e4be40',1,'cv::cudev::operator>(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53328b4712dbd36f5bc5fc303973997c',1,'cv::cudev::operator>(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fcd4b8ca094ed23e6c523f312c075b8',1,'cv::cudev::operator>(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e9ae77beea1adff95bca10ef7401942',1,'cv::cudev::operator>(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga208a8ecd6574e328b8b89dce3d96550a',1,'cv::cudev::operator>(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeba9c5a1af22468fa4de9e27a7291c17',1,'cv::cudev::operator>(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60ce8fe5baf2a39a1963c206fe8f2283',1,'cv::cudev::operator>(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3605088dd4d00bc3d812c01485e0c854',1,'cv::cudev::operator>(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae77b149d4b2eda29c2d2e09c7a265f1',1,'cv::cudev::operator>(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9707f1f0bd1f08a43c8c6faaf389ef',1,'cv::cudev::operator>(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa790adfb4f6f2fa460c244f2f7621ed3',1,'cv::cudev::operator>(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeed166390fcd3b6634764bad3f4dfe99',1,'cv::cudev::operator>(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd896dcb0ea5b24ddf9a17b006ed2701',1,'cv::cudev::operator>(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae003f99da4c8129f3ce6908560dd6598',1,'cv::cudev::operator>(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac94d95ec080ec57be5729ff0a14d6740',1,'cv::cudev::operator>(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3292736e722c948bfee81f8ce13d285',1,'cv::cudev::operator>(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eadb9c719cbffb8161d58910fc8bf13',1,'cv::cudev::operator>(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5aa17050b6e23908154a490b186e5592',1,'cv::cudev::operator>(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad280748a5ba0aaef06f5f48f8d162fd0',1,'cv::cudev::operator>(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga122cfa74c83428505a928ea12d304942',1,'cv::cudev::operator>(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a4586e4cf8cd4353f49b0ac4d474553',1,'cv::cudev::operator>(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39b292f62396880cbe964128a125a2a8',1,'cv::cudev::operator>(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557ed1e9462d24223497a0c53db7d90',1,'cv::cudev::operator>(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b85167fb47e745fce108d23ae3674e0',1,'cv::cudev::operator>(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef695f029df417b63799eff1f8e20218',1,'cv::cudev::operator>(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdda92bd64d36ec1d43b5ce270677166',1,'cv::cudev::operator>(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff20e4d2dbcb670af32bba301c579fbc',1,'cv::cudev::operator>(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ec6a668ce4bdaee3fb96cd6af71bd59',1,'cv::cudev::operator>(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1eba4d1da0623f9c69a57db9e769144',1,'cv::cudev::operator>(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ed513d4cb9e4110d3db70f50be835ba',1,'cv::cudev::operator>(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fbdf61b01310dfb036bb6ffef461b8a',1,'cv::cudev::operator>(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab1a02c460ac72367d4652923fba630b',1,'cv::cudev::operator>(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga293527eeddad289a3efad53f1a4b6f3f',1,'cv::cudev::operator>(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadc84b344cba3e9d8279cce4daa335a3',1,'cv::cudev::operator>(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae6976ca05a71a3867491b1d63a38d79',1,'cv::cudev::operator>(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4d496fb1ee18b3cd918b6a3092c629',1,'cv::cudev::operator>(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9683b0f490d61333a0c9b0ac6177c797',1,'cv::cudev::operator>(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf173de4fa9a66e44f6e01e46e50fb96e',1,'cv::cudev::operator>(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6961930505501ab67e70de1bec1fc7c',1,'cv::cudev::operator>(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3be2422dd410d768a47a1523612c6e2',1,'cv::cudev::operator>(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga231392fd7250c8b1cba1027db6dd2f59',1,'cv::cudev::operator>(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7365378eede3da961a558ff603f0a8f2',1,'cv::cudev::operator>(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a4ad2ef4e95c53079cda25bcb76fc53',1,'cv::cudev::operator>(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga337362bc409dec3c7470826563fd08d5',1,'cv::cudev::operator>(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a78dc7183016b7eaa8994891ac7349e',1,'cv::cudev::operator>(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb89d12f168130b16b6a852fbcf29ac1',1,'cv::cudev::operator>(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd0188a961cefcfb26b7b15fac712e82',1,'cv::cudev::operator>(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13fc85d9e1c15b1d1d2c862936ab29cf',1,'cv::cudev::operator>(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6d6be81f2d1ad7424d414f6028a6dfd',1,'cv::cudev::operator>(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c3a579dea9a2c50a6082bf7c5c50d1f',1,'cv::cudev::operator>(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c88870704b2df7f664851aed891ab38',1,'cv::cudev::operator>(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabfe335f05bb7a355f8e2cf6d4ad83c3',1,'cv::cudev::operator>(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444c5e1f7f62cf798066d5659366df23',1,'cv::cudev::operator>(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab561641feed35c20278ece35bb8797b3',1,'cv::cudev::operator>(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b861ce2de51abdd03593b3d3d84f684',1,'cv::cudev::operator>(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c1fd7fbe4e5985f1d2fa725731eb08',1,'cv::cudev::operator>(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9e6afe8941f12362335b1a80e42496',1,'cv::cudev::operator>(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9896d8eed5804f7d4900f8b8266295ba',1,'cv::cudev::operator>(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca64d102ed2cfae7f3abeb781421204',1,'cv::cudev::operator>(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac833608b2481b20d0d91a71036d45d',1,'cv::cudev::operator>(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2237c47c62d003ee6a19ff2b3cd54b2',1,'cv::cudev::operator>(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990332db3565090a646987254c79fab4',1,'cv::cudev::operator>(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4e587facdf3b1a86a40be230639efef',1,'cv::cudev::operator>(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67f6d1cb7b1b325a6dfe5414dbb94dbd',1,'cv::cudev::operator>(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98a98af64c25c869aae0f4ad0c55af4',1,'cv::cudev::operator>(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fd6dc47e174621164179fbf737f2809',1,'cv::cudev::operator>(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd34ffd2648022fee481fe264945565c',1,'cv::cudev::operator>(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c9c2d7a26f8d9c7b8834f9f190a8914',1,'cv::cudev::operator>(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga640d6afcfb462ced93eefa1b697cd060',1,'cv::cudev::operator>(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa37cb32841f9ffa14b1936e05a1ebe9',1,'cv::cudev::operator>(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e97195a2b7cecf5ede8e47d260723c',1,'cv::cudev::operator>(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga335811f06efddba5e75ce0116d04783a',1,'cv::cudev::operator>(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa4f074c9ea9489fd8b41157998c5fed',1,'cv::cudev::operator>(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f1e7ce1a6510265ead6b6207f39effc',1,'cv::cudev::operator>(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9756cee47606a4de0ca1c3c8e97a40b2',1,'cv::cudev::operator>(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d783278f798a238eb375b58e4eeade4',1,'cv::cudev::operator>(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab439a8c37814ba930d4f4f0d15095883',1,'cv::cudev::operator>(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad508ec58830cc1077eb07e8fc153fd',1,'cv::cudev::operator>(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga408471782e6c3338d5ee9de16e31644e',1,'cv::cudev::operator>(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35415f4fd50ebd8a203fef079c54ec8d',1,'cv::cudev::operator>(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14fe180ed1d9c9666c46e88a36c421a8',1,'cv::cudev::operator>(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab45d33bf92b38f1331208282fda45064',1,'cv::cudev::operator>(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c384571fec644fe63911fd26bf6e6b',1,'cv::cudev::operator>(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31473d08b4bb642729365caf9a6c0e39',1,'cv::cudev::operator>(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa100c0ecc7e8aec9341b40562ac55b3a',1,'cv::cudev::operator>(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb98ebc2ade19b8e960fa40f5d6a253e',1,'cv::cudev::operator>(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eaa0d1ca6c4bb54774350171b9e16b5',1,'cv::cudev::operator>(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6458afcdc07e562050e4315122f859d2',1,'cv::cudev::operator>(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d2cc8c1b0507e85f915853485ecc6d0',1,'cv::cudev::operator>(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9e6bd3f5911bf05d858b143d76813b13',1,'operator>(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga89a6048ae27277f5f84458078a447a7b',1,'operator>(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga53b1ef03655e02eabf49238a5927f384',1,'operator>(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf76a5cbe9661c03341fed10338283b3a',1,'operator>(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35b979bc99aa0c19b8b03d0191c0aef',1,'operator>(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fe6218c267adf7bf750b607bcee1dde',1,'operator>(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557a3a12df84d433097b5f1df0d7d04',1,'operator>(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga192ad383159b69ca2292f072b38508f9',1,'operator>(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd71f8794eb458670da81e6e31ebd40d',1,'operator>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga805cfea7bfd59489c103d6ea068e5dd8',1,'operator>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga876bfb5116ae02ad4707fb201477a535',1,'operator>(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58c9c31838a279487423f7f3582c4913',1,'operator>(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c5037a273d23375d3020863519e7732',1,'operator>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81c1cf50caa6fdfec4decace6bfacbff',1,'operator>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9020160028347e36054f9780e546ad2',1,'operator>(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09090c1f87b4fcc6c50a59befc7b7d1',1,'operator>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5762932e36ee52fdf93dc9af9a9ae5f',1,'operator>(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga631a8e54c62472f3efd66b05c220ac99',1,'operator>(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ca5edb7aebb689a224b13a06da7c096',1,'operator>(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92f4356bcda49befcae07fe5897806ef',1,'operator>(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga462d276943a4befba6bd1e5f7597ab43',1,'operator>(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab987b25924d83dcbbb586e8c82b54457',1,'operator>(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab42431af22ff2b15ff34bc2ca158d648',1,'operator>(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ecf652b96c5cf329f62e04e798c7938',1,'operator>(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6181bf9f0fc217c2fa0062df7dd997',1,'operator>(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78139b6caee2bfff7f7e416fd4c0fa86',1,'operator>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33f4d71b881eec12c81fa08710e13b90',1,'operator>(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa24e4c795c4f9dff281f74e4a49517',1,'operator>(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga979bbc65c1aa9cb961473faeec0c001d',1,'operator>(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga763bba01a3388aa4241f24b934a36b9e',1,'operator>(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a322f89d75c39df09b42d571cde02c',1,'operator>(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadea03e1ebb6998d08fe7e356fc675da4',1,'operator>(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfd53947e82410ed70ef8af8e469be95',1,'operator>(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00fc760015647c4518fc1c250b34f3a0',1,'operator>(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aac1815665d44067eae7d8cb4e4be40',1,'operator>(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53328b4712dbd36f5bc5fc303973997c',1,'operator>(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fcd4b8ca094ed23e6c523f312c075b8',1,'operator>(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e9ae77beea1adff95bca10ef7401942',1,'operator>(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga208a8ecd6574e328b8b89dce3d96550a',1,'operator>(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeba9c5a1af22468fa4de9e27a7291c17',1,'operator>(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60ce8fe5baf2a39a1963c206fe8f2283',1,'operator>(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3605088dd4d00bc3d812c01485e0c854',1,'operator>(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae77b149d4b2eda29c2d2e09c7a265f1',1,'operator>(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9707f1f0bd1f08a43c8c6faaf389ef',1,'operator>(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa790adfb4f6f2fa460c244f2f7621ed3',1,'operator>(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeed166390fcd3b6634764bad3f4dfe99',1,'operator>(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd896dcb0ea5b24ddf9a17b006ed2701',1,'operator>(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae003f99da4c8129f3ce6908560dd6598',1,'operator>(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac94d95ec080ec57be5729ff0a14d6740',1,'operator>(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3292736e722c948bfee81f8ce13d285',1,'operator>(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eadb9c719cbffb8161d58910fc8bf13',1,'operator>(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5aa17050b6e23908154a490b186e5592',1,'operator>(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad280748a5ba0aaef06f5f48f8d162fd0',1,'operator>(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga122cfa74c83428505a928ea12d304942',1,'operator>(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a4586e4cf8cd4353f49b0ac4d474553',1,'operator>(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39b292f62396880cbe964128a125a2a8',1,'operator>(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557ed1e9462d24223497a0c53db7d90',1,'operator>(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b85167fb47e745fce108d23ae3674e0',1,'operator>(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef695f029df417b63799eff1f8e20218',1,'operator>(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdda92bd64d36ec1d43b5ce270677166',1,'operator>(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff20e4d2dbcb670af32bba301c579fbc',1,'operator>(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ec6a668ce4bdaee3fb96cd6af71bd59',1,'operator>(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1eba4d1da0623f9c69a57db9e769144',1,'operator>(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ed513d4cb9e4110d3db70f50be835ba',1,'operator>(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fbdf61b01310dfb036bb6ffef461b8a',1,'operator>(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab1a02c460ac72367d4652923fba630b',1,'operator>(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga293527eeddad289a3efad53f1a4b6f3f',1,'operator>(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadc84b344cba3e9d8279cce4daa335a3',1,'operator>(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae6976ca05a71a3867491b1d63a38d79',1,'operator>(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4d496fb1ee18b3cd918b6a3092c629',1,'operator>(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9683b0f490d61333a0c9b0ac6177c797',1,'operator>(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf173de4fa9a66e44f6e01e46e50fb96e',1,'operator>(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6961930505501ab67e70de1bec1fc7c',1,'operator>(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3be2422dd410d768a47a1523612c6e2',1,'operator>(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga231392fd7250c8b1cba1027db6dd2f59',1,'operator>(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7365378eede3da961a558ff603f0a8f2',1,'operator>(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a4ad2ef4e95c53079cda25bcb76fc53',1,'operator>(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga337362bc409dec3c7470826563fd08d5',1,'operator>(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a78dc7183016b7eaa8994891ac7349e',1,'operator>(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb89d12f168130b16b6a852fbcf29ac1',1,'operator>(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd0188a961cefcfb26b7b15fac712e82',1,'operator>(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13fc85d9e1c15b1d1d2c862936ab29cf',1,'operator>(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6d6be81f2d1ad7424d414f6028a6dfd',1,'operator>(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c3a579dea9a2c50a6082bf7c5c50d1f',1,'operator>(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c88870704b2df7f664851aed891ab38',1,'operator>(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabfe335f05bb7a355f8e2cf6d4ad83c3',1,'operator>(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444c5e1f7f62cf798066d5659366df23',1,'operator>(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab561641feed35c20278ece35bb8797b3',1,'operator>(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b861ce2de51abdd03593b3d3d84f684',1,'operator>(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c1fd7fbe4e5985f1d2fa725731eb08',1,'operator>(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9e6afe8941f12362335b1a80e42496',1,'operator>(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9896d8eed5804f7d4900f8b8266295ba',1,'operator>(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca64d102ed2cfae7f3abeb781421204',1,'operator>(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac833608b2481b20d0d91a71036d45d',1,'operator>(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2237c47c62d003ee6a19ff2b3cd54b2',1,'operator>(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990332db3565090a646987254c79fab4',1,'operator>(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4e587facdf3b1a86a40be230639efef',1,'operator>(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67f6d1cb7b1b325a6dfe5414dbb94dbd',1,'operator>(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98a98af64c25c869aae0f4ad0c55af4',1,'operator>(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fd6dc47e174621164179fbf737f2809',1,'operator>(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd34ffd2648022fee481fe264945565c',1,'operator>(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c9c2d7a26f8d9c7b8834f9f190a8914',1,'operator>(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga640d6afcfb462ced93eefa1b697cd060',1,'operator>(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa37cb32841f9ffa14b1936e05a1ebe9',1,'operator>(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e97195a2b7cecf5ede8e47d260723c',1,'operator>(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga335811f06efddba5e75ce0116d04783a',1,'operator>(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa4f074c9ea9489fd8b41157998c5fed',1,'operator>(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f1e7ce1a6510265ead6b6207f39effc',1,'operator>(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9756cee47606a4de0ca1c3c8e97a40b2',1,'operator>(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d783278f798a238eb375b58e4eeade4',1,'operator>(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab439a8c37814ba930d4f4f0d15095883',1,'operator>(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad508ec58830cc1077eb07e8fc153fd',1,'operator>(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga408471782e6c3338d5ee9de16e31644e',1,'operator>(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35415f4fd50ebd8a203fef079c54ec8d',1,'operator>(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14fe180ed1d9c9666c46e88a36c421a8',1,'operator>(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab45d33bf92b38f1331208282fda45064',1,'operator>(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c384571fec644fe63911fd26bf6e6b',1,'operator>(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31473d08b4bb642729365caf9a6c0e39',1,'operator>(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa100c0ecc7e8aec9341b40562ac55b3a',1,'operator>(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb98ebc2ade19b8e960fa40f5d6a253e',1,'operator>(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eaa0d1ca6c4bb54774350171b9e16b5',1,'operator>(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6458afcdc07e562050e4315122f859d2',1,'operator>(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d2cc8c1b0507e85f915853485ecc6d0',1,'operator>(double s, const double1 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a4888830ee6fb21e7bb62e14a2ab70ba2',1,'__gnu_cxx::operator>(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a15ea80c5370562c6713c383c5277c3c0',1,'__gnu_cxx::operator>(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a3137c36cfc4f7bc7580eb06bc8d2845c',1,'__gnu_cxx::operator>(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a886fc839debeebe4e1453774a028d1e3',1,'std::operator>(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6116f2ba6a75587900983e4a6662a528',1,'std::operator>(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga00de6fe7684f71fc08bad81b4bc65c52',1,'std::operator>(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afd4ebca607a5d77bce0ce62ed7c86fb9',1,'std::operator>(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a76a6b1542f3e854da212df3a9046cd05',1,'std::operator>(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaec6e1b27604a07cb7a1158c0a1da0810',1,'std::operator>(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga61879ec22c8f941d3bc5a6f57f094779',1,'std::operator>(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a14156f76400cead9187280c59587a8f1',1,'std::operator>(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20e59f399d0143cf0517ed705d5f095a',1,'std::operator>(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5554501d29b4f818450c37cbf8e3b403',1,'std::operator>(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga99794cccf99b31cbb9c80f20ff638cc0',1,'std::operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaaee0b4d314905566d4d083f1f3cabfa4',1,'std::operator>(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a1d46b9793f5a9a6d38267007fabb0e05',1,'std::operator>(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac70654ce03713da520f19dc5a9a87edc',1,'std::operator>(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1bdb78aca267183451bbd59a262f52c9',1,'std::operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a3a727df15fd08af612b872262e50a95f',1,'std::operator>(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7788944c30c3070441dc376df8beb210',1,'std::operator>(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af745511bf2598950056525a3fd7a346b',1,'std::operator>(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a56282963f192a45f81f55fa9c6a8005a',1,'std::operator>(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0f0b7503d67a8bd548778912aa40de84',1,'std::operator>(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab05d57b2cc8854cbdb97bc0676abf2c0',1,'std::operator>(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a84b60842f88cb57f0075a964c68794b5',1,'std::__debug::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a8885d72d87c6b3b0441124b7e625b92d',1,'std::__profile::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#a05cd508a43f05f31e7fb298edd7a84e1',1,'std::rel_ops::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gabc26fba16414cb3d2c1247de4be61cfd',1,'std::tr2::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gabc26fba16414cb3d2c1247de4be61cfd',1,'operator>(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaec6e1b27604a07cb7a1158c0a1da0810',1,'operator>(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga61879ec22c8f941d3bc5a6f57f094779',1,'operator>(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20e59f399d0143cf0517ed705d5f095a',1,'operator>(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5554501d29b4f818450c37cbf8e3b403',1,'operator>(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga99794cccf99b31cbb9c80f20ff638cc0',1,'operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaaee0b4d314905566d4d083f1f3cabfa4',1,'operator>(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1bdb78aca267183451bbd59a262f52c9',1,'operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga00de6fe7684f71fc08bad81b4bc65c52',1,'operator>(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], - ['operator_3e_3d_125',['operator>=',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a39f3eecb2debd3e05e155d8769597994',1,'cv::MatExpr::operator>=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a908e8895c1daab24e5e8be7b9adddf12',1,'cv::MatExpr::operator>=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae5acab862f659f77658f59c723791d2d',1,'cv::MatExpr::operator>=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#afb86a86ce5bdb62722ad6a2c38eb2279',1,'cv::MatExpr::operator>=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac87dbdcc89fc97aff6e94ff635da8949',1,'cv::MatExpr::operator>=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a39f3eecb2debd3e05e155d8769597994',1,'cv::MatExpr::operator>=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a908e8895c1daab24e5e8be7b9adddf12',1,'cv::MatExpr::operator>=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae5acab862f659f77658f59c723791d2d',1,'cv::MatExpr::operator>=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#afb86a86ce5bdb62722ad6a2c38eb2279',1,'cv::MatExpr::operator>=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac87dbdcc89fc97aff6e94ff635da8949',1,'cv::MatExpr::operator>=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga7523b2303cf5a3e9343147742f277149',1,'cv::softdouble::operator>=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3899c1c417984a878e1623a12f364a6b',1,'cv::softfloat::operator>=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga192e4da1bbd83aa64b5e2e86dba8f9e9',1,'cv::operator>=()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5330cc80f66e09053ad401da24bfe0',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55b886854f93ec539b81f73de542c40d',1,'cv::cudev::operator>=(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61c7293a315c1910a0d1c6bf5963a67f',1,'cv::cudev::operator>=(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1373cae04cbfcbed044238b4c0012f52',1,'cv::cudev::operator>=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66183c3c065c37807ae7a9aac89d9683',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b53ea181ce1eb43fe1ae329325e99e8',1,'cv::cudev::operator>=(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59dbec8b57764f129596bdbcdd1e3562',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga204eca640e93cedab25090194331d1e2',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d31376fae318ac2ab9434b0d4722af',1,'cv::cudev::operator>=(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad95a5e9db7d69228b51369c9c896b56a',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89fd435cb3c2b6f23d64a7f3b4819810',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb2b192959982b295e1f878e1566591',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc12a2670b0ad46ad9469d31eebddf1b',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e8c18e6ea5465dcb4e5ac9943b2dfd5',1,'cv::cudev::operator>=(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43f457f9623ab455d55dd8f1d0327f71',1,'cv::cudev::operator>=(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5aecb08d3a88db58f50c4fb709b7933',1,'cv::cudev::operator>=(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb4d3916b4d585e3643669ec78803951',1,'cv::cudev::operator>=(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6029848613f09b4123c7938a88c53a',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0815757e177f6d5b7721244f12f6903',1,'cv::cudev::operator>=(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3fcf73436590c1ce9ad286097fe9cfc',1,'cv::cudev::operator>=(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f31eca1742f7f20d7e80cac55cbffe6',1,'cv::cudev::operator>=(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ed0450c5195379d076650cf1be91169',1,'cv::cudev::operator>=(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf4d4a962b7b8c6ca198d746416b5c3d',1,'cv::cudev::operator>=(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga477ddd386db964f74d70293d7687b0c8',1,'cv::cudev::operator>=(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7765769643c89f70c73d35ec4a3cadd',1,'cv::cudev::operator>=(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c680c140830f6d38dd143b428e2f4',1,'cv::cudev::operator>=(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf21a4fde0acb285c32c1d56008abcf41',1,'cv::cudev::operator>=(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3afa887b077a0f377b27f72350df7259',1,'cv::cudev::operator>=(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed44ab15e814fce58a672cdb92eaaaf0',1,'cv::cudev::operator>=(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8406f156d41ec17be418590d2e953a74',1,'cv::cudev::operator>=(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1f9c52c48f29114947a08f0984cc23',1,'cv::cudev::operator>=(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga539493c0b07035d7e67d87bd68856ca4',1,'cv::cudev::operator>=(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef31a3f97ef6709045c6c5e280dffef1',1,'cv::cudev::operator>=(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547d2e06b7c5d87d0392acfbbb350e3d',1,'cv::cudev::operator>=(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebe853d079262445e933d64c232dea87',1,'cv::cudev::operator>=(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b136da085c473eec683b0d25665d999',1,'cv::cudev::operator>=(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abf293a57acdb1d193efdbeb48850b7',1,'cv::cudev::operator>=(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc74e9748c7d824f4c402e7443157efd',1,'cv::cudev::operator>=(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4cfc621933360fd6c3a21434b90477a',1,'cv::cudev::operator>=(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade5ffb51464ed9a304c6ccf1eea95bff',1,'cv::cudev::operator>=(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba4b299c1f9f39e23300e9dda97f1a5',1,'cv::cudev::operator>=(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga588bf5d735442049d6513d94884fcd33',1,'cv::cudev::operator>=(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3c9bc60881121216c407af1a319ed6',1,'cv::cudev::operator>=(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6951e256e5788320f1eca5105f76596f',1,'cv::cudev::operator>=(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8694d45c659b1fee5f7806e99aac8e7',1,'cv::cudev::operator>=(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d6eedcf500e803f32a17150b27968a5',1,'cv::cudev::operator>=(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f344776a2bbd8f29184a166ef092af2',1,'cv::cudev::operator>=(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e41bcdfabc98e9ec2de85bc163826b5',1,'cv::cudev::operator>=(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f33674629adbf0b08b4fb78c25495cc',1,'cv::cudev::operator>=(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1dada72f050c77f7e18d2bf96c8e376',1,'cv::cudev::operator>=(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab363efde6df231138d5222b1b6bd48f3',1,'cv::cudev::operator>=(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb8f7ad533a2657bd11aabdcdd7ee987',1,'cv::cudev::operator>=(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a68b7438b043a42d8732d97012003f5',1,'cv::cudev::operator>=(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4154e5c15631b66c54787029ebc990c3',1,'cv::cudev::operator>=(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45a21bb3cd57a2e993037143309e84e1',1,'cv::cudev::operator>=(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dc323ca96973f3bb10ea8ff03296b78',1,'cv::cudev::operator>=(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08b0e1e9ffda58046cd9889f7068e649',1,'cv::cudev::operator>=(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4edddce6542f00b2cb1de230437ba40b',1,'cv::cudev::operator>=(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24927de1bc04bacffcbb04310862f2e',1,'cv::cudev::operator>=(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb3f698e36d064129d4414b2ad6a9a3e',1,'cv::cudev::operator>=(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ccf77a9b8d87c2980e3d2f435125264',1,'cv::cudev::operator>=(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga249d6a87d32bd5ad9f4e22f32ccd632a',1,'cv::cudev::operator>=(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b591de78c118edddff4887525e0c5d9',1,'cv::cudev::operator>=(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaac862fd70672e334a90773b88267455',1,'cv::cudev::operator>=(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga775f874d3cba778e3c0cae929b525fc8',1,'cv::cudev::operator>=(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4590cd1de2f1f07aa520e168ea968c27',1,'cv::cudev::operator>=(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e5b8010cca18aab7e53847d1133ce81',1,'cv::cudev::operator>=(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85ba6a29fe83842bfffc726e582b5ee3',1,'cv::cudev::operator>=(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e36f2665d9739cc06ae0cb2562e8c0',1,'cv::cudev::operator>=(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e320de3bce9ed33ff9c8fc57be6d39',1,'cv::cudev::operator>=(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad59ee5976df102e72b1ff749231c9f47',1,'cv::cudev::operator>=(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67126297a64ef25f2c3194020fca3cad',1,'cv::cudev::operator>=(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a68b5ab03282686225ed7b88012c4b',1,'cv::cudev::operator>=(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae68aad51dc7f176ef197ee8c43c3a41d',1,'cv::cudev::operator>=(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga474292d4a9c6579fc2d31c9dcdcaa971',1,'cv::cudev::operator>=(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee757427c34f7ec54713ef3daae854ef',1,'cv::cudev::operator>=(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73786eb58807a17a538c755e34d9675d',1,'cv::cudev::operator>=(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab24f6ed6cb8e1e447b97a75be6654f7f',1,'cv::cudev::operator>=(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae61d709025c856d3146d10cb7e788d75',1,'cv::cudev::operator>=(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga802b60c4cd50658153f7e88b252935c5',1,'cv::cudev::operator>=(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab681691fbf17f68b4e9d588645b08116',1,'cv::cudev::operator>=(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d8502df0ee39c8dbae6ae47d4806b8a',1,'cv::cudev::operator>=(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8ffbcfb9495f8eea8cde1af08039d6',1,'cv::cudev::operator>=(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcbec3693958703c755c64ce0937ba3',1,'cv::cudev::operator>=(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7768c8e69a236df27818762a8f104c35',1,'cv::cudev::operator>=(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6879e2b18878ecceaab7af951c8d02fc',1,'cv::cudev::operator>=(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacacfa7f605da556808ffabf98be76b0',1,'cv::cudev::operator>=(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa4b9df279731155760f059dbe663be7',1,'cv::cudev::operator>=(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga932feafc496906a1677f88fc87ea080b',1,'cv::cudev::operator>=(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0b5d7bde9d408e0589cd5f21072be91',1,'cv::cudev::operator>=(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053ac7b33a7fdc5d34218983001f0f43',1,'cv::cudev::operator>=(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c72029e1748eb9921b128c7e1306487',1,'cv::cudev::operator>=(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga646651e94a7b468f128be9c30a448e94',1,'cv::cudev::operator>=(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f6ccf218473b80b7b2dcc253febdc9a',1,'cv::cudev::operator>=(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9507310e4ad6cfcbca66c2fd7c7082f',1,'cv::cudev::operator>=(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b1151c7a2a2ddd85dcf62518c58d49',1,'cv::cudev::operator>=(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0edff402253aa4596b3dc6854b6af18e',1,'cv::cudev::operator>=(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1531b3d6906a273b4cf9e8c56e19caa',1,'cv::cudev::operator>=(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fbf32a1fa03bb675190ebd2adb3ac70',1,'cv::cudev::operator>=(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34384f5470f48a898cd982db515575c3',1,'cv::cudev::operator>=(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2b88160c219e0921cfea0acf8c246c5',1,'cv::cudev::operator>=(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga478501caf9d016ecb74e586aa74a8eff',1,'cv::cudev::operator>=(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga343064aec5bc2570785ee2e4b25f2190',1,'cv::cudev::operator>=(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2eab9bc4ae70aa428b0a54595b4d1b2',1,'cv::cudev::operator>=(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad08e83716e56a26fe1d0e187f0d119c0',1,'cv::cudev::operator>=(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4010de5c35fd52658f696ef5106f8d8b',1,'cv::cudev::operator>=(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6abb0e15698a012d2de983ded0ab3030',1,'cv::cudev::operator>=(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d8af3d392d78262551dea823f822220',1,'cv::cudev::operator>=(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2ed51d9bd9237ec4ee957a2861de80d7',1,'cv::cudev::operator>=(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae5341fc17764c044f28d7510fd879d',1,'cv::cudev::operator>=(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510b88a926bd78ed6550626a57f297f5',1,'cv::cudev::operator>=(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a824a0f0b67806b6db61f3532ec2c97',1,'cv::cudev::operator>=(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95c4a13893450c74268cecbb7a4d47a7',1,'cv::cudev::operator>=(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ddf2b8e66168e64e5baec6ce0e558e',1,'cv::cudev::operator>=(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e68f9ecf09b25e36f1530afba43747d',1,'cv::cudev::operator>=(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4827daed85d7647479290921fae85f9',1,'cv::cudev::operator>=(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga731e1a86a51c771a75d83daa958df9e0',1,'cv::cudev::operator>=(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1f457d5eb24579073db8c8c0dd3d1ad',1,'cv::cudev::operator>=(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8e092faec9f57baa41674711a444ea',1,'cv::cudev::operator>=(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga541f5919f746411f043d670afb3ba7b3',1,'cv::cudev::operator>=(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3899c1c417984a878e1623a12f364a6b',1,'operator>=(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga7523b2303cf5a3e9343147742f277149',1,'operator>=(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga192e4da1bbd83aa64b5e2e86dba8f9e9',1,'operator>=(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5330cc80f66e09053ad401da24bfe0',1,'operator>=(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55b886854f93ec539b81f73de542c40d',1,'operator>=(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61c7293a315c1910a0d1c6bf5963a67f',1,'operator>=(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1373cae04cbfcbed044238b4c0012f52',1,'operator>=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66183c3c065c37807ae7a9aac89d9683',1,'operator>=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b53ea181ce1eb43fe1ae329325e99e8',1,'operator>=(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59dbec8b57764f129596bdbcdd1e3562',1,'operator>=(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga204eca640e93cedab25090194331d1e2',1,'operator>=(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d31376fae318ac2ab9434b0d4722af',1,'operator>=(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad95a5e9db7d69228b51369c9c896b56a',1,'operator>=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89fd435cb3c2b6f23d64a7f3b4819810',1,'operator>=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb2b192959982b295e1f878e1566591',1,'operator>=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc12a2670b0ad46ad9469d31eebddf1b',1,'operator>=(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e8c18e6ea5465dcb4e5ac9943b2dfd5',1,'operator>=(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43f457f9623ab455d55dd8f1d0327f71',1,'operator>=(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5aecb08d3a88db58f50c4fb709b7933',1,'operator>=(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb4d3916b4d585e3643669ec78803951',1,'operator>=(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6029848613f09b4123c7938a88c53a',1,'operator>=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0815757e177f6d5b7721244f12f6903',1,'operator>=(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3fcf73436590c1ce9ad286097fe9cfc',1,'operator>=(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f31eca1742f7f20d7e80cac55cbffe6',1,'operator>=(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ed0450c5195379d076650cf1be91169',1,'operator>=(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf4d4a962b7b8c6ca198d746416b5c3d',1,'operator>=(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga477ddd386db964f74d70293d7687b0c8',1,'operator>=(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7765769643c89f70c73d35ec4a3cadd',1,'operator>=(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c680c140830f6d38dd143b428e2f4',1,'operator>=(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf21a4fde0acb285c32c1d56008abcf41',1,'operator>=(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3afa887b077a0f377b27f72350df7259',1,'operator>=(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed44ab15e814fce58a672cdb92eaaaf0',1,'operator>=(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8406f156d41ec17be418590d2e953a74',1,'operator>=(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1f9c52c48f29114947a08f0984cc23',1,'operator>=(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga539493c0b07035d7e67d87bd68856ca4',1,'operator>=(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef31a3f97ef6709045c6c5e280dffef1',1,'operator>=(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547d2e06b7c5d87d0392acfbbb350e3d',1,'operator>=(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebe853d079262445e933d64c232dea87',1,'operator>=(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b136da085c473eec683b0d25665d999',1,'operator>=(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abf293a57acdb1d193efdbeb48850b7',1,'operator>=(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc74e9748c7d824f4c402e7443157efd',1,'operator>=(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4cfc621933360fd6c3a21434b90477a',1,'operator>=(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade5ffb51464ed9a304c6ccf1eea95bff',1,'operator>=(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba4b299c1f9f39e23300e9dda97f1a5',1,'operator>=(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga588bf5d735442049d6513d94884fcd33',1,'operator>=(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3c9bc60881121216c407af1a319ed6',1,'operator>=(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6951e256e5788320f1eca5105f76596f',1,'operator>=(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8694d45c659b1fee5f7806e99aac8e7',1,'operator>=(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d6eedcf500e803f32a17150b27968a5',1,'operator>=(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f344776a2bbd8f29184a166ef092af2',1,'operator>=(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e41bcdfabc98e9ec2de85bc163826b5',1,'operator>=(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f33674629adbf0b08b4fb78c25495cc',1,'operator>=(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1dada72f050c77f7e18d2bf96c8e376',1,'operator>=(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab363efde6df231138d5222b1b6bd48f3',1,'operator>=(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb8f7ad533a2657bd11aabdcdd7ee987',1,'operator>=(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a68b7438b043a42d8732d97012003f5',1,'operator>=(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4154e5c15631b66c54787029ebc990c3',1,'operator>=(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45a21bb3cd57a2e993037143309e84e1',1,'operator>=(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dc323ca96973f3bb10ea8ff03296b78',1,'operator>=(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08b0e1e9ffda58046cd9889f7068e649',1,'operator>=(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4edddce6542f00b2cb1de230437ba40b',1,'operator>=(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24927de1bc04bacffcbb04310862f2e',1,'operator>=(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb3f698e36d064129d4414b2ad6a9a3e',1,'operator>=(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ccf77a9b8d87c2980e3d2f435125264',1,'operator>=(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga249d6a87d32bd5ad9f4e22f32ccd632a',1,'operator>=(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b591de78c118edddff4887525e0c5d9',1,'operator>=(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaac862fd70672e334a90773b88267455',1,'operator>=(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga775f874d3cba778e3c0cae929b525fc8',1,'operator>=(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4590cd1de2f1f07aa520e168ea968c27',1,'operator>=(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e5b8010cca18aab7e53847d1133ce81',1,'operator>=(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85ba6a29fe83842bfffc726e582b5ee3',1,'operator>=(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e36f2665d9739cc06ae0cb2562e8c0',1,'operator>=(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e320de3bce9ed33ff9c8fc57be6d39',1,'operator>=(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad59ee5976df102e72b1ff749231c9f47',1,'operator>=(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67126297a64ef25f2c3194020fca3cad',1,'operator>=(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a68b5ab03282686225ed7b88012c4b',1,'operator>=(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae68aad51dc7f176ef197ee8c43c3a41d',1,'operator>=(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga474292d4a9c6579fc2d31c9dcdcaa971',1,'operator>=(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee757427c34f7ec54713ef3daae854ef',1,'operator>=(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73786eb58807a17a538c755e34d9675d',1,'operator>=(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab24f6ed6cb8e1e447b97a75be6654f7f',1,'operator>=(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae61d709025c856d3146d10cb7e788d75',1,'operator>=(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga802b60c4cd50658153f7e88b252935c5',1,'operator>=(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab681691fbf17f68b4e9d588645b08116',1,'operator>=(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d8502df0ee39c8dbae6ae47d4806b8a',1,'operator>=(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8ffbcfb9495f8eea8cde1af08039d6',1,'operator>=(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcbec3693958703c755c64ce0937ba3',1,'operator>=(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7768c8e69a236df27818762a8f104c35',1,'operator>=(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6879e2b18878ecceaab7af951c8d02fc',1,'operator>=(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacacfa7f605da556808ffabf98be76b0',1,'operator>=(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa4b9df279731155760f059dbe663be7',1,'operator>=(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga932feafc496906a1677f88fc87ea080b',1,'operator>=(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0b5d7bde9d408e0589cd5f21072be91',1,'operator>=(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053ac7b33a7fdc5d34218983001f0f43',1,'operator>=(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c72029e1748eb9921b128c7e1306487',1,'operator>=(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga646651e94a7b468f128be9c30a448e94',1,'operator>=(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f6ccf218473b80b7b2dcc253febdc9a',1,'operator>=(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9507310e4ad6cfcbca66c2fd7c7082f',1,'operator>=(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b1151c7a2a2ddd85dcf62518c58d49',1,'operator>=(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0edff402253aa4596b3dc6854b6af18e',1,'operator>=(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1531b3d6906a273b4cf9e8c56e19caa',1,'operator>=(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fbf32a1fa03bb675190ebd2adb3ac70',1,'operator>=(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34384f5470f48a898cd982db515575c3',1,'operator>=(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2b88160c219e0921cfea0acf8c246c5',1,'operator>=(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga478501caf9d016ecb74e586aa74a8eff',1,'operator>=(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga343064aec5bc2570785ee2e4b25f2190',1,'operator>=(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2eab9bc4ae70aa428b0a54595b4d1b2',1,'operator>=(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad08e83716e56a26fe1d0e187f0d119c0',1,'operator>=(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4010de5c35fd52658f696ef5106f8d8b',1,'operator>=(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6abb0e15698a012d2de983ded0ab3030',1,'operator>=(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d8af3d392d78262551dea823f822220',1,'operator>=(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2ed51d9bd9237ec4ee957a2861de80d7',1,'operator>=(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae5341fc17764c044f28d7510fd879d',1,'operator>=(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510b88a926bd78ed6550626a57f297f5',1,'operator>=(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a824a0f0b67806b6db61f3532ec2c97',1,'operator>=(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95c4a13893450c74268cecbb7a4d47a7',1,'operator>=(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ddf2b8e66168e64e5baec6ce0e558e',1,'operator>=(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e68f9ecf09b25e36f1530afba43747d',1,'operator>=(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4827daed85d7647479290921fae85f9',1,'operator>=(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga731e1a86a51c771a75d83daa958df9e0',1,'operator>=(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1f457d5eb24579073db8c8c0dd3d1ad',1,'operator>=(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8e092faec9f57baa41674711a444ea',1,'operator>=(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga541f5919f746411f043d670afb3ba7b3',1,'operator>=(double s, const double1 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a1ec2deb39f1b5127f5a8bb2b26450c03',1,'__gnu_cxx::operator>=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a9fd2a7c53cf7d775379e0d6097658545',1,'__gnu_cxx::operator>=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#aa626858a9a44d7932ad8c38fb4905b34',1,'__gnu_cxx::operator>=(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a11bb9b3800196c309babae27f4b4a900',1,'std::operator>=(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac65d320a052a5d4d1477ef25b5627be5',1,'std::operator>=(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga4abfa75dbeb7ee6922ab97aaaba57d47',1,'std::operator>=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acddc46a5f1205d53f5f682a89259c38e',1,'std::operator>=(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abf5b635cc4dfc9f737e9a3933b6d7e06',1,'std::operator>=(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga9ee66c57996b60af8514834ba5054af4',1,'std::operator>=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga81455a2af5c1721d3340fa06eaccfe06',1,'std::operator>=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a69dd44d827cf392b3490c7498d47cd5b',1,'std::operator>=(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa4a816fd640e88c0b2e9b0bb6cc4cb19',1,'std::operator>=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga86523db2bbd873f4bc26c42a77f443b3',1,'std::operator>=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1225fba40c8af2c834e8201af601829b',1,'std::operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga71a6363d6cad986521d5f5a1537a1e06',1,'std::operator>=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8bd7da47a9941d7e825411420feb6ac1',1,'std::operator>=(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a03f03b3697da916e95a09b1488df52df',1,'std::operator>=(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fdb938850a723e8e447fce21fc0b7c2',1,'std::operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9a32938be630f180eddc69f0402d13ca',1,'std::operator>=(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a628eda81f6cb2988d8f5908f631cdb46',1,'std::operator>=(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5e3f58e54e9cbbcda75328fada9fa1a5',1,'std::operator>=(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4fd05c4c42075e6787d13b7dd454ba77',1,'std::operator>=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a56fe512b61535754991c71651054a4a3',1,'std::operator>=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad9ef507927a631a73f69c9d4d8add693',1,'std::operator>=(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a636d8ef229361158ab4945c00d7676be',1,'std::__debug::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a73aff27c428faa615874629ae0250e64',1,'std::__profile::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#ac93a7559412662f6dfd7c206ecb98f99',1,'std::rel_ops::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga08b65275697884e0facdf36f73c0bb7d',1,'std::tr2::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga08b65275697884e0facdf36f73c0bb7d',1,'operator>=(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga9ee66c57996b60af8514834ba5054af4',1,'operator>=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga81455a2af5c1721d3340fa06eaccfe06',1,'operator>=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa4a816fd640e88c0b2e9b0bb6cc4cb19',1,'operator>=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga86523db2bbd873f4bc26c42a77f443b3',1,'operator>=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1225fba40c8af2c834e8201af601829b',1,'operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga71a6363d6cad986521d5f5a1537a1e06',1,'operator>=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fdb938850a723e8e447fce21fc0b7c2',1,'operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga4abfa75dbeb7ee6922ab97aaaba57d47',1,'operator>=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], - ['operator_3e_3e_126',['operator>>',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aeff689aa3f1d9e49c24e22b097d17b04',1,'cv::FileNode::operator>>(const FileNode &n, _Tp &value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a4e6bc57b90b1336bc5fdaa055c5295cc',1,'cv::FileNode::operator>>(const FileNode &n, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a002a7403a3c77de6fdb3e080cf4657db',1,'cv::FileNode::operator>>(const FileNode &n, KeyPoint &kpt)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9137a05efd7738001795800234e73eef',1,'cv::FileNode::operator>>(const FileNode &n, DMatch &m)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aeff689aa3f1d9e49c24e22b097d17b04',1,'cv::FileNode::operator>>(const FileNode &n, _Tp &value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a4e6bc57b90b1336bc5fdaa055c5295cc',1,'cv::FileNode::operator>>(const FileNode &n, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a002a7403a3c77de6fdb3e080cf4657db',1,'cv::FileNode::operator>>(const FileNode &n, KeyPoint &kpt)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9137a05efd7738001795800234e73eef',1,'cv::FileNode::operator>>(const FileNode &n, DMatch &m)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a0e9987928ef46a3fe99b3fe02b659dd4',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, _Tp &value)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a1b91e417a7103145b4997e086aec99df',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a0e9987928ef46a3fe99b3fe02b659dd4',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, _Tp &value)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a1b91e417a7103145b4997e086aec99df',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a199844fb74226a28b3ce3a39d1ff6765',1,'cv::VideoCapture::operator>>(Mat &image)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a35eb427f16b4ea5c502922aba9da835c',1,'cv::VideoCapture::operator>>(UMat &image)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'basic_iostream< char >::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'basic_iostream< char >::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_iostream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_iostream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_iostream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_iostream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_iostream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_iostream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_iostream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_iostream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_iostream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_iostream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_iostream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_iostream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_iostream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_iostream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_iostream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_iostream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_iostream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_iostream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_iostream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_iostream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_iostream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_iostream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_iostream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_iostream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_iostream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_iostream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_iostream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_iostream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_iostream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_iostream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'basic_istream< char >::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'basic_istream< char >::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'basic_istream< char, _Traits >::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'basic_istream< char, _Traits >::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char, _Traits >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char, _Traits >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char, _Traits >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char, _Traits >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char, _Traits >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char, _Traits >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char, _Traits >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char, _Traits >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char, _Traits >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char, _Traits >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char, _Traits >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char, _Traits >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char, _Traits >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char, _Traits >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char, _Traits >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char, _Traits >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char, _Traits >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char, _Traits >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char, _Traits >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char, _Traits >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char, _Traits >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char, _Traits >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char, _Traits >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char, _Traits >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char, _Traits >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char, _Traits >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char, _Traits >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char, _Traits >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char, _Traits >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char, _Traits >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_fstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_fstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_fstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_fstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_fstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_fstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_fstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_fstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_fstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_fstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_fstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_fstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_fstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_fstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_fstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_fstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_fstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_fstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_fstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_fstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_fstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_fstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_fstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_fstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_fstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_fstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_fstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_fstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_fstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_fstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_fstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_fstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_ifstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_ifstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_ifstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_ifstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_ifstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_ifstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_ifstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_ifstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_ifstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_ifstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_ifstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_ifstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_ifstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_ifstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_ifstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_ifstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_ifstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_ifstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_ifstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_ifstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_ifstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_ifstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_ifstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_ifstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_ifstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_ifstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_ifstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_ifstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_ifstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_ifstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_ifstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_ifstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_iostream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_iostream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_iostream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_iostream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_iostream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_iostream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_iostream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_iostream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_iostream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_iostream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_iostream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_iostream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_iostream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_iostream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_iostream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_iostream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_iostream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_iostream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_iostream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_iostream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_iostream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_iostream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_iostream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_iostream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_iostream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_iostream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_iostream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_iostream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_iostream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_iostream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_iostream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_iostream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_istream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_istream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_istringstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_istringstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_stringstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_stringstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_stringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_stringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_stringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_stringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_stringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_stringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_stringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_stringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_stringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_stringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_stringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_stringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_stringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_stringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_stringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_stringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_stringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_stringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_stringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_stringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_stringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_stringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_stringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_stringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_stringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_stringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_stringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_stringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_stringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_stringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aeba729a09e2f6c19b000476fa7eb0fcd',1,'std::bitset::operator>>(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aeba729a09e2f6c19b000476fa7eb0fcd',1,'std::bitset::operator>>(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae9a03a35d703cdbbf1155330a59eed57',1,'std::tr2::dynamic_bitset::operator>>(size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae9a03a35d703cdbbf1155330a59eed57',1,'std::tr2::dynamic_bitset::operator>>(size_type __pos) const'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaae9733cc2b353835e1a8723dcfc171e2',1,'cv::operator>>()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a685b4cdb4af2a8d7a68fbfcd8e2548',1,'cv::cudev::operator>>(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga837d4419807a80ee32b3c961913cb7e4',1,'cv::cudev::operator>>(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefe26fd801b0820623044113109b13ec',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490716b718d4dd43c89d51694861843b',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5290b7ec0ee646136f388beb08e115f8',1,'cv::cudev::operator>>(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2d998b1143eae5f5d4f6cfebdfb00df',1,'cv::cudev::operator>>(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9af265df70ba6c6606a9384e989ae155',1,'cv::cudev::operator>>(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23a3e1f1df0cc826fa1e31152ef3c721',1,'cv::cudev::operator>>(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f3301b8bc25bdd2cb00ee98a81030b4',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c5c20ba9fe5527ded3ff0fd72f53cbf',1,'cv::cudev::operator>>(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05f308ef809ecd39ef9985554956d16a',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad327490c86961a8f0a65abc413fa546f',1,'cv::cudev::operator>>(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b60617070fde498fd3217af505e0c1',1,'cv::cudev::operator>>(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147aab19cdedc271193e916d905e7caf',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056be68e684c65e2836b5ef1b8089d3f',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac382672463e961bd8ab509e436b94494',1,'cv::cudev::operator>>(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa742399be625c93c587e8c358d0885cc',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga659b874a5439f4483fc9c1a7f6ea5d1f',1,'cv::cudev::operator>>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa23bb682b46b78eef7c4c6febadd786c',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3fe97f46e29307fc51714496a0de0e3',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70f05e9528501005e278d9767f670818',1,'cv::cudev::operator>>(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e10e34970a384ffc99c5a56d78098bb',1,'cv::cudev::operator>>(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga036cb20b4c06864975ca4df3a6a7e1c3',1,'cv::cudev::operator>>(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dfe8d94a8059fea9c67a71fe1654cbf',1,'cv::cudev::operator>>(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaae9733cc2b353835e1a8723dcfc171e2',1,'operator>>(const v_reg< _Tp, n > &a, int imm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a685b4cdb4af2a8d7a68fbfcd8e2548',1,'operator>>(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga837d4419807a80ee32b3c961913cb7e4',1,'operator>>(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefe26fd801b0820623044113109b13ec',1,'operator>>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490716b718d4dd43c89d51694861843b',1,'operator>>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5290b7ec0ee646136f388beb08e115f8',1,'operator>>(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2d998b1143eae5f5d4f6cfebdfb00df',1,'operator>>(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9af265df70ba6c6606a9384e989ae155',1,'operator>>(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23a3e1f1df0cc826fa1e31152ef3c721',1,'operator>>(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f3301b8bc25bdd2cb00ee98a81030b4',1,'operator>>(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c5c20ba9fe5527ded3ff0fd72f53cbf',1,'operator>>(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05f308ef809ecd39ef9985554956d16a',1,'operator>>(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad327490c86961a8f0a65abc413fa546f',1,'operator>>(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b60617070fde498fd3217af505e0c1',1,'operator>>(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147aab19cdedc271193e916d905e7caf',1,'operator>>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056be68e684c65e2836b5ef1b8089d3f',1,'operator>>(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac382672463e961bd8ab509e436b94494',1,'operator>>(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa742399be625c93c587e8c358d0885cc',1,'operator>>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga659b874a5439f4483fc9c1a7f6ea5d1f',1,'operator>>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa23bb682b46b78eef7c4c6febadd786c',1,'operator>>(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3fe97f46e29307fc51714496a0de0e3',1,'operator>>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70f05e9528501005e278d9767f670818',1,'operator>>(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e10e34970a384ffc99c5a56d78098bb',1,'operator>>(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga036cb20b4c06864975ca4df3a6a7e1c3',1,'operator>>(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dfe8d94a8059fea9c67a71fe1654cbf',1,'operator>>(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf81c75e50c9ee8a791d90329d2fc7ef8',1,'std::operator>>(basic_istream< _CharT, _Traits > &__is, complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acda683e8b3ae5f1dd425bb99774304a7',1,'std::operator>>(_Istream &&__is, _Tp &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gab49649ed7cc5cb819ce52620f227b1a7',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_int_distribution< _IntType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gafb5c87acd910ec70edaedef33cf32aee',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_real_distribution< _RealType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a113f151882a47755a4b297813977bbdc',1,'std::operator>>(basic_istream< _CharT, _Traits > &__is, __gnu_cxx::__versa_string< _CharT, _Traits, _Alloc, _Base > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga63a43b47a5315c8b1b55002af2eb1669',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::cauchy_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga2a24c2f5da07f3a713e036875355ad57',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::bernoulli_distribution &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga30ec0007b5169ab3c6847033db603493',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::geometric_distribution< _IntType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5dbbb1871bc0160e0b9cf609e222fb18',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::exponential_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gae0fa60823d48bfd5b1d7a7c0063826ba',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::weibull_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga391e8f9fb533a5fb81f4099e9b03ff6a',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::extreme_value_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6447193cb914c78fb13064c210e26ed8',1,'std::operator>>(basic_istream< _CharT, _Traits > &__is, basic_string< _CharT, _Traits, _Alloc > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a01cd5810d682dec840eee4ed6d2170d4',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, bitset< _Nb > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8f6ffa961cd02381c76b3d3345641f4d',1,'std::operator>>(basic_istream< _CharT, _Traits > &__in, _CharT &__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad29bf992665f01e4a3623420b87f40d3',1,'std::operator>>(basic_istream< char, _Traits > &__in, unsigned char &__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a257b6c1fab9276d9a9ca63c29279d48c',1,'std::operator>>(basic_istream< char, _Traits > &__in, signed char &__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afd645e31e415b300d870dba3de0af813',1,'std::operator>>(basic_istream< _CharT, _Traits > &__in, _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a40a0021a5cf39a79c2ff66d3c31ae277',1,'std::operator>>(basic_istream< char > &__in, char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aefcf45965f6bebc6083ba4d0207cca1d',1,'std::operator>>(basic_istream< char, _Traits > &__in, unsigned char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abcee0d0bbe61b8a00e0336411d295f79',1,'std::operator>>(basic_istream< char, _Traits > &__in, signed char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html#a9dc7b861adff63cefa05b539068f727e',1,'std::__detail::operator>>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga4618b05732d8eec5161f28b23c23227d',1,'std::tr2::operator>>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga2a24c2f5da07f3a713e036875355ad57',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::bernoulli_distribution &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga30ec0007b5169ab3c6847033db603493',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::geometric_distribution< _IntType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf81c75e50c9ee8a791d90329d2fc7ef8',1,'operator>>(basic_istream< _CharT, _Traits > &__is, complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga4618b05732d8eec5161f28b23c23227d',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, dynamic_bitset< _WordT, _Alloc > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga63a43b47a5315c8b1b55002af2eb1669',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::cauchy_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5dbbb1871bc0160e0b9cf609e222fb18',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::exponential_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gae0fa60823d48bfd5b1d7a7c0063826ba',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::weibull_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga391e8f9fb533a5fb81f4099e9b03ff6a',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::extreme_value_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gab49649ed7cc5cb819ce52620f227b1a7',1,'operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_int_distribution< _IntType > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gafb5c87acd910ec70edaedef33cf32aee',1,'operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_real_distribution< _RealType > &)(Global Namespace)']]], - ['operator_3e_3e_3d_127',['operator>>=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac07ef85ee38aa3428883eb50f719cbca',1,'std::bitset::operator>>=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac07ef85ee38aa3428883eb50f719cbca',1,'std::bitset::operator>>=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8293a4feaf1bde96e155e6ba528d0b9a',1,'std::gslice_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga611bd59fab7a43ce79f1707eea03be7a',1,'std::indirect_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga87f02d439b80dd0d351ae9f827c4f77e',1,'std::mask_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7ebc66086e23f1d4bb5cc554fedde16b',1,'std::slice_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab0acb45e7697ddaa619582139a55227e',1,'std::tr2::dynamic_bitset::operator>>=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab0acb45e7697ddaa619582139a55227e',1,'std::tr2::dynamic_bitset::operator>>=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5ce6f32c286043434e864d28271f2069',1,'std::valarray::operator>>=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7f2a41abd2f316f4de7942652da2410d',1,'std::valarray::operator>>=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5ce6f32c286043434e864d28271f2069',1,'valarray< size_t >::operator>>=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7f2a41abd2f316f4de7942652da2410d',1,'valarray< size_t >::operator>>=(const valarray< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8293a4feaf1bde96e155e6ba528d0b9a',1,'operator>>=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5ce6f32c286043434e864d28271f2069',1,'operator>>=(const _Tp &)(Global Namespace)']]], - ['operator_5b_5d_128',['operator[]',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a544bdab727d3b76828c915b0fe30a8e6',1,'cv::FileNode::operator[](const String &nodename) const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a611004b953e5a13140f2d344ed4f6398',1,'cv::FileNode::operator[](const char *nodename) const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a031b7f492abe0f414a7627272bd6e467',1,'cv::FileNode::operator[](int i) const'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#adc7eff268ab95c664657a03e72ed85a5',1,'cv::FileStorage::operator[](const String &nodename) const'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a532f6a27dd57d0f640c6a5a9acddac88',1,'cv::FileStorage::operator[](const char *nodename) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ac04a07edf33eaef0dce8a2c7d5d193b2',1,'cv::cudev::GpuMat_::operator[](int y)'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a1caf23a850242f18af5cab4478b127b5',1,'cv::cudev::GpuMat_::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'cv::Mat_::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'cv::Mat_::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< double >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< double >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< float >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< float >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< uchar >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< uchar >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< unsigned char >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< unsigned char >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#aaf943dc53b7d402993ccc1f44412b594',1,'cv::MatConstIterator::operator[]()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ad9682e4ade6a6f2b83d85b30d94b978f',1,'cv::MatConstIterator_::operator[]()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ab96bf874711db314307ac6a711666e85',1,'cv::MatIterator_::operator[]()'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#aa43c8afeb7e798ea5f1d585d1d3eab93',1,'cv::MatSize::operator[](int i) const'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a8a0c5d3f786fae008a10a6e3bc962215',1,'cv::MatSize::operator[](int i)'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#ae1261117212294e7dbd88c57dc4eb655',1,'cv::MatStep::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a8a4d7e49dff4d9c705e4840a5af56f70',1,'cv::MatStep::operator[](int i)'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#afc4d1e3df056b5fed3c76f0a03a212d4',1,'cv::gapi::own::Scalar::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#aa3d769161bbbcb027050c7e17ff1cade',1,'cv::gapi::own::Scalar::operator[](int i)'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a24367c518aca63c85976897fedd3153a',1,'cv::tbm::Track::operator[](size_t i) const'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#aa202964fa465e9edc7833c848866530c',1,'cv::tbm::Track::operator[](size_t i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'cv::Vec::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'cv::Vec::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< _Tp, 4 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< _Tp, 4 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, 2 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, 2 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, 3 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, 3 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, 4 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, 4 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, nFeatures >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, nFeatures >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< float, 2 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< float, 2 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< float, 3 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< float, 3 >::operator[](int i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab2b57e74d31d0fc2340d2cece8700b4a',1,'__gnu_cxx::__versa_string::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9b58791d4ef7809989f8eaf599f980f1',1,'__gnu_cxx::__versa_string::operator[](size_type __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< _CharT >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< _CharT >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< _CharT, _Traits, _Allocator >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< _CharT, _Traits, _Allocator >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< char >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< char >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< char_type, _Traits, _Alloc >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< char_type, _Traits, _Alloc >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< value_type >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< value_type >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a461a433ad999e2d22e10f45addf1bb67',1,'deque< _StateSeqT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a513a4ab26ac9df40d7ec95fc50e1218b',1,'deque< _StateSeqT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6021c27572ef3bc03cea38c66dde3783',1,'match_results< _Bi_iter >::operator[](size_type __sub) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'match_results< _Bi_iter >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'match_results< _Bi_iter >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6021c27572ef3bc03cea38c66dde3783',1,'match_results< _Bi_iter >::operator[](size_type __sub) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'std::basic_string::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'std::basic_string::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a03ad7ade15b93f22b17648d53ba20062',1,'std::bitset::operator[](size_t __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#afa6b9908b9752384b42da517a3ae3d8c',1,'std::bitset::operator[](size_t __position) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a03ad7ade15b93f22b17648d53ba20062',1,'std::bitset::operator[](size_t __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#afa6b9908b9752384b42da517a3ae3d8c',1,'std::bitset::operator[](size_t __position) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a461a433ad999e2d22e10f45addf1bb67',1,'std::deque::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a513a4ab26ac9df40d7ec95fc50e1218b',1,'std::deque::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a4a4a9f95131baf0713596d672ec36b5f',1,'std::map::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'std::match_results::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'std::match_results::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6021c27572ef3bc03cea38c66dde3783',1,'std::match_results::operator[](size_type __sub) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a4dadeeb9101dbd3d257043519e6e35f8',1,'std::reverse_iterator::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a7b05f8159b467622dc2804f276ecc8ea',1,'std::tr2::dynamic_bitset::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a78022be7125e50468596e2a0e0df4a3b',1,'std::tr2::dynamic_bitset::operator[](size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a7b05f8159b467622dc2804f276ecc8ea',1,'std::tr2::dynamic_bitset::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a78022be7125e50468596e2a0e0df4a3b',1,'std::tr2::dynamic_bitset::operator[](size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a6fb7ee5ca798c98fa24524f0df6edd59',1,'std::unique_ptr< _Tp[], _Dp >::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'std::unordered_map::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'std::unordered_map::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'std::unordered_map::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'std::unordered_map::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2325176078e58966124ec919df2b1eb4',1,'std::valarray::operator[](size_t __i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e86bbdb258433295ab39596449a5f7e',1,'std::valarray::operator[](slice __s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad5394a15e9c7edd4ecece4534d3c3ba3',1,'std::valarray::operator[](slice __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga28ef76e86bd06a99b58af17899554590',1,'std::valarray::operator[](const gslice &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gae5e23cc8dbbeee72c16868aad85731ba',1,'std::valarray::operator[](const gslice &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f454eb267fee574dadea61b69b94d31',1,'std::valarray::operator[](const valarray< bool > &__m) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga24fb191ad805190686652a3a8bf7169b',1,'std::valarray::operator[](const valarray< bool > &__m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2d1a225784345f3c5eb3e94e984e5e00',1,'std::valarray::operator[](const valarray< size_t > &__i) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafcd1719464554185069224f2fd837de3',1,'std::valarray::operator[](const valarray< size_t > &__i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'std::vector::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'std::vector::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2325176078e58966124ec919df2b1eb4',1,'valarray< size_t >::operator[](size_t __i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e86bbdb258433295ab39596449a5f7e',1,'valarray< size_t >::operator[](slice __s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad5394a15e9c7edd4ecece4534d3c3ba3',1,'valarray< size_t >::operator[](slice __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga28ef76e86bd06a99b58af17899554590',1,'valarray< size_t >::operator[](const gslice &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gae5e23cc8dbbeee72c16868aad85731ba',1,'valarray< size_t >::operator[](const gslice &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f454eb267fee574dadea61b69b94d31',1,'valarray< size_t >::operator[](const valarray< bool > &__m) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga24fb191ad805190686652a3a8bf7169b',1,'valarray< size_t >::operator[](const valarray< bool > &__m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2d1a225784345f3c5eb3e94e984e5e00',1,'valarray< size_t >::operator[](const valarray< size_t > &__i) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafcd1719464554185069224f2fd837de3',1,'valarray< size_t >::operator[](const valarray< size_t > &__i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< __diff_type >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< __diff_type >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _CharClassT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _CharClassT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _CharT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _CharT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _Cmpt >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _Cmpt >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _Node *, _Nodeptr_Alloc >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _Node *, _Nodeptr_Alloc >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _RealType >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _RealType >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _State< _TraitsT::char_type > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _State< _TraitsT::char_type > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _StringT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _StringT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< block_type, allocator_type >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< block_type, allocator_type >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< Catalog_info * >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< Catalog_info * >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< double >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< double >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< int >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< int >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< result_type >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< result_type >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< size_t >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< size_t >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< std::pair< _BiIter, int > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< std::pair< _BiIter, int > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< std::pair< _StateIdT, std::vector > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< std::pair< _StateIdT, std::vector > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< sub_match< _BiIter >, _Alloc >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< sub_match< _BiIter >, _Alloc >::operator[](size_type __n) const noexcept'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArithmeticSequence.html#a890959dd45db1bbee103c1861c53ffad',1,'Eigen::ArithmeticSequence::operator[]()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a496672306836589fa04a6ab33cb0cf2a',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::operator[]()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#aa2040f14e60fed1a4a68ca7f042e1bbf',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::operator[]()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9ea67fc1ef0ccc42e1d5388fe0416ae5.html#a9ea67fc1ef0ccc42e1d5388fe0416ae5',1,'nlohmann::basic_json::operator[](size_type idx)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad21d96f490fa1aa8605fba8dadcce319.html#ad21d96f490fa1aa8605fba8dadcce319',1,'nlohmann::basic_json::operator[](size_type idx) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3f45f3820c456ad2e3f3df2926564151.html#a3f45f3820c456ad2e3f3df2926564151',1,'nlohmann::basic_json::operator[](const typename object_t::key_type &key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_acb5b489310f4e0ce2d5fb29b73fb59d3.html#acb5b489310f4e0ce2d5fb29b73fb59d3',1,'nlohmann::basic_json::operator[](const typename object_t::key_type &key) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_abc94831476f7b4d3efe6f2e9036c7188.html#abc94831476f7b4d3efe6f2e9036c7188',1,'nlohmann::basic_json::operator[](T *key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a11bbe874496eb7b29a5549e0637de59e.html#a11bbe874496eb7b29a5549e0637de59e',1,'nlohmann::basic_json::operator[](T *key) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0d3deaa73b3644b4da3f8ef3172cd8d2.html#a0d3deaa73b3644b4da3f8ef3172cd8d2',1,'nlohmann::basic_json::operator[](const json_pointer &ptr)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0a691c29eb7c4acd91ccb498a79cd3ee.html#a0a691c29eb7c4acd91ccb498a79cd3ee',1,'nlohmann::basic_json::operator[](const json_pointer &ptr) const'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_ae7a1ca8c1e234837d137471f73ae6012.html#ae7a1ca8c1e234837d137471f73ae6012',1,'nlohmann::ordered_map::operator[](const Key &key)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a676082659d575e29bdb312bcde53023a.html#a676082659d575e29bdb312bcde53023a',1,'nlohmann::ordered_map::operator[](const Key &key) const'],['../classAR_1_1MarkerSet.html#abb1041eb9fc43bb7919406f08de27784',1,'AR::MarkerSet::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2325176078e58966124ec919df2b1eb4',1,'operator[](size_t __i)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e86bbdb258433295ab39596449a5f7e',1,'operator[](slice __s) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga28ef76e86bd06a99b58af17899554590',1,'operator[](const gslice &__s) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f454eb267fee574dadea61b69b94d31',1,'operator[](const valarray< bool > &__m) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2d1a225784345f3c5eb3e94e984e5e00',1,'operator[](const valarray< size_t > &__i) const(Global Namespace)']]], - ['operator_5e_129',['operator^',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9afbc19e8756efdbc92e17d096540ce5',1,'cv::MatExpr::operator^(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abc36e16ecd042df954771a99068a6c49',1,'cv::MatExpr::operator^(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9867b0d5e11c2fef494b71e51d21da1b',1,'cv::MatExpr::operator^(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a15cd0aff27ba61cb2563894b01547e7e',1,'cv::MatExpr::operator^(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac559f4bd48f3660ee56a223258dc6bb9',1,'cv::MatExpr::operator^(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9afbc19e8756efdbc92e17d096540ce5',1,'cv::MatExpr::operator^(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abc36e16ecd042df954771a99068a6c49',1,'cv::MatExpr::operator^(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9867b0d5e11c2fef494b71e51d21da1b',1,'cv::MatExpr::operator^(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a15cd0aff27ba61cb2563894b01547e7e',1,'cv::MatExpr::operator^(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac559f4bd48f3660ee56a223258dc6bb9',1,'cv::MatExpr::operator^(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga7c759a9f061d90e4c6dac60aa74fb986',1,'cv::operator^()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f2db1ff7a6beee9d6abb68fca5486',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19bb391512f5ba4c2fee17b49f482269',1,'cv::cudev::operator^(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6996ae50fe4252f163301d6440a5c244',1,'cv::cudev::operator^(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35bf74a15b738d8b54e7bc12bbae0993',1,'cv::cudev::operator^(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae841dcb6dd5dbac738ea6f92c8c68b68',1,'cv::cudev::operator^(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga382357929ae811bbfc4e808b4e3bc8f2',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b81aa937cefb46d9896886aeeaa883c',1,'cv::cudev::operator^(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68a8e460780b94e85614d7785cbd3cb2',1,'cv::cudev::operator^(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7067102ad5f321c066fa7f2db3566b63',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff97ad64d1178cb4f6022f6c046d9e19',1,'cv::cudev::operator^(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae05c59b91c6841b7b4513e54e6de72db',1,'cv::cudev::operator^(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga553a0ab64e059b30e81c8ab8802d1ddf',1,'cv::cudev::operator^(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce073b221be8f03e1af8d35b795efa5',1,'cv::cudev::operator^(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae247dcb0213e92795a12085731f99b49',1,'cv::cudev::operator^(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f61a3af63ded7c934b5859eefd1e108',1,'cv::cudev::operator^(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa347f52f3f818f094c59a9cdf1f18ae8',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fad8e805a97475f06edef6af6bf976c',1,'cv::cudev::operator^(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9546d5b0db6ba30340fb1d19a1428be',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee3dfc9cff4b1d5f64e0351e091d27f',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7221d69a134b0ef5b08e97bb968d0762',1,'cv::cudev::operator^(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68fca21ce958616bb3cce2827c81bcb1',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga219e0d330b1ae4f6c55ef2bc9cd61b54',1,'cv::cudev::operator^(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c7b83d9c2a632dacbcd26a6bc71fcb8',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc55eed4cb6100456719dd7d42ab840',1,'cv::cudev::operator^(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa05edd1f94210980d40ecd8615e6cd',1,'cv::cudev::operator^(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57b0beb61b6838a8997630c88d57b1c0',1,'cv::cudev::operator^(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga574dbf94893fb637932048a1da56f61e',1,'cv::cudev::operator^(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a2d82b647bfdd3d8b9f555255b08446',1,'cv::cudev::operator^(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67b57ea4eeeb2dfc404c0596ad12a003',1,'cv::cudev::operator^(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f084768a0834cb515abe7cc12e5a5c2',1,'cv::cudev::operator^(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga262bbf2d811490645625b3c0819db5a9',1,'cv::cudev::operator^(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9008ea56e80e41f137fae6c4f29c5e2c',1,'cv::cudev::operator^(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b226fe3a602b25eb493c5b47675b115',1,'cv::cudev::operator^(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f177c946e1c5b13bda7e1a4d6b14792',1,'cv::cudev::operator^(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba1a42db310a4daf0fb2865aaf7f5201',1,'cv::cudev::operator^(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb9bef1f86ce4022e33132f5a80b4ae',1,'cv::cudev::operator^(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeaf6f4ae0c4adbf3594389355fc10fc6',1,'cv::cudev::operator^(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6307095b70d98cfb7875659cd516c9d7',1,'cv::cudev::operator^(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga276ef3a39dccd5a558013568f8e10634',1,'cv::cudev::operator^(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b709e4bac601f7322655f2bdb989cae',1,'cv::cudev::operator^(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2081fb9edca3a8318295766946442143',1,'cv::cudev::operator^(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42a42be02e720782ac6d6a890f87df34',1,'cv::cudev::operator^(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf503ce80b70d5e95589c6bcc5dcdc534',1,'cv::cudev::operator^(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86b5ec62d72169a5af71fbef20395bf7',1,'cv::cudev::operator^(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc0fe10ccf8bffd6a42d61a2cb7b7630',1,'cv::cudev::operator^(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29e1fa7243c5a45d5b4a8333ef5e4ad4',1,'cv::cudev::operator^(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace59218cd1224e9bd4e71d44effb706e',1,'cv::cudev::operator^(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb305d044d1d79eaa26884fa8691b13c',1,'cv::cudev::operator^(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92297263151c479220003960e6c94826',1,'cv::cudev::operator^(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23dec7e74c18bf4befb0e357ffada712',1,'cv::cudev::operator^(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc8b1ea1436679399d6de28a93f37c7c',1,'cv::cudev::operator^(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cdbc34390912374b3c016740db6e5a1',1,'cv::cudev::operator^(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga562e145a0cc65fa6571d18d0b5304fcd',1,'cv::cudev::operator^(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1487d3dd6d9e842c3f266fdef9b3cd06',1,'cv::cudev::operator^(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bdf640af5ef6c8037f04d2a21f72624',1,'cv::cudev::operator^(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be79933bce514a940a915865400b1be',1,'cv::cudev::operator^(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa8c7b4fcf0364baf63899bab7585b4',1,'cv::cudev::operator^(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c856e8c20c27045d1016b675fea6c29',1,'cv::cudev::operator^(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a4d4f19b1228d8c35964c9631b12db1',1,'cv::cudev::operator^(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc9f85f2cd8647cac819333b0b5d90d2',1,'cv::cudev::operator^(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed751d867269bace54872e57a083af43',1,'cv::cudev::operator^(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9d23aba1973ca8fd1ea7c710c89d9c9',1,'cv::cudev::operator^(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a5b7d75125123f6c481b6b5335baf5',1,'cv::cudev::operator^(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1860e2d6fbcabfd958136c1d2a873565',1,'cv::cudev::operator^(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7064aa0e201b06e6456b7225ab13b76f',1,'cv::cudev::operator^(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182950bf07b543f15aef63a570a75740',1,'cv::cudev::operator^(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7cb4644f2a37866175abd213e99bf9c',1,'cv::cudev::operator^(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga106351f7f67aac5a4539cf2da429051b',1,'cv::cudev::operator^(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5c2aa1114fc5bc919fecf84836a85bb',1,'cv::cudev::operator^(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e81b5c59f5873a9b2b355605d4628c4',1,'cv::cudev::operator^(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24aac76e0a255dbf62c78f3f5ac1b4d6',1,'cv::cudev::operator^(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7de7a8c28d3b5cc29651d6128ca2d910',1,'cv::cudev::operator^(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f1c529d765c81d140c77108626aa14a',1,'cv::cudev::operator^(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef0821f6c671d9712c7238465f8d4884',1,'cv::cudev::operator^(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2daad5e0b4930181e2e66c9f17f93c20',1,'cv::cudev::operator^(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ff5a2a334e85c74b8286600064aae8b',1,'cv::cudev::operator^(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63ccaabd5ee595473b9dc5bd77d9948e',1,'cv::cudev::operator^(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab653e7053862a95e577b8db3322dd49c',1,'cv::cudev::operator^(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6976070c4b0ebc9d2ac34bc7c325b112',1,'cv::cudev::operator^(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147cb8d515df77bc9dda9bd957c21a75',1,'cv::cudev::operator^(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8caa79576d2640d9c571dcbf39c41f9e',1,'cv::cudev::operator^(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga536c9c60a5f68e761b71f7a521bd440f',1,'cv::cudev::operator^(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga309e3255d388c6334fa4baccb66c39c4',1,'cv::cudev::operator^(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga844cecceba28036b2ef12a014b0ccfb7',1,'cv::cudev::operator^(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga930dfc19c86c269dba903a06651d79b1',1,'cv::cudev::operator^(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc31b023630642daa958687ede735dc',1,'cv::cudev::operator^(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga260712aebe5466a8e4f01ea498d2ca02',1,'cv::cudev::operator^(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09aac80f9054e642a162795b850c973b',1,'cv::cudev::operator^(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056a095b396077c1a14f6e237ba69f62',1,'cv::cudev::operator^(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4424230c30d8785f0c7ecb0903651540',1,'cv::cudev::operator^(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b85716ad8e68247c20bbf301d5db78b',1,'cv::cudev::operator^(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61455fe5de691c1102ebec11128de52a',1,'cv::cudev::operator^(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga754806ed446290afea054d4cab646e54',1,'cv::cudev::operator^(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd6445fdc04ff5606d05f981dac957ee',1,'cv::cudev::operator^(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3903754f858daaf6174edeec6c964db1',1,'cv::cudev::operator^(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ae473eb2417fa915fb5d169be28d0d6',1,'cv::cudev::operator^(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga7c759a9f061d90e4c6dac60aa74fb986',1,'operator^(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f2db1ff7a6beee9d6abb68fca5486',1,'operator^(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19bb391512f5ba4c2fee17b49f482269',1,'operator^(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6996ae50fe4252f163301d6440a5c244',1,'operator^(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35bf74a15b738d8b54e7bc12bbae0993',1,'operator^(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae841dcb6dd5dbac738ea6f92c8c68b68',1,'operator^(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga382357929ae811bbfc4e808b4e3bc8f2',1,'operator^(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b81aa937cefb46d9896886aeeaa883c',1,'operator^(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68a8e460780b94e85614d7785cbd3cb2',1,'operator^(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7067102ad5f321c066fa7f2db3566b63',1,'operator^(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff97ad64d1178cb4f6022f6c046d9e19',1,'operator^(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae05c59b91c6841b7b4513e54e6de72db',1,'operator^(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga553a0ab64e059b30e81c8ab8802d1ddf',1,'operator^(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce073b221be8f03e1af8d35b795efa5',1,'operator^(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae247dcb0213e92795a12085731f99b49',1,'operator^(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f61a3af63ded7c934b5859eefd1e108',1,'operator^(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa347f52f3f818f094c59a9cdf1f18ae8',1,'operator^(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fad8e805a97475f06edef6af6bf976c',1,'operator^(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9546d5b0db6ba30340fb1d19a1428be',1,'operator^(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee3dfc9cff4b1d5f64e0351e091d27f',1,'operator^(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7221d69a134b0ef5b08e97bb968d0762',1,'operator^(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68fca21ce958616bb3cce2827c81bcb1',1,'operator^(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga219e0d330b1ae4f6c55ef2bc9cd61b54',1,'operator^(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c7b83d9c2a632dacbcd26a6bc71fcb8',1,'operator^(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc55eed4cb6100456719dd7d42ab840',1,'operator^(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa05edd1f94210980d40ecd8615e6cd',1,'operator^(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57b0beb61b6838a8997630c88d57b1c0',1,'operator^(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga574dbf94893fb637932048a1da56f61e',1,'operator^(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a2d82b647bfdd3d8b9f555255b08446',1,'operator^(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67b57ea4eeeb2dfc404c0596ad12a003',1,'operator^(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f084768a0834cb515abe7cc12e5a5c2',1,'operator^(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga262bbf2d811490645625b3c0819db5a9',1,'operator^(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9008ea56e80e41f137fae6c4f29c5e2c',1,'operator^(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b226fe3a602b25eb493c5b47675b115',1,'operator^(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f177c946e1c5b13bda7e1a4d6b14792',1,'operator^(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba1a42db310a4daf0fb2865aaf7f5201',1,'operator^(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb9bef1f86ce4022e33132f5a80b4ae',1,'operator^(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeaf6f4ae0c4adbf3594389355fc10fc6',1,'operator^(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6307095b70d98cfb7875659cd516c9d7',1,'operator^(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga276ef3a39dccd5a558013568f8e10634',1,'operator^(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b709e4bac601f7322655f2bdb989cae',1,'operator^(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2081fb9edca3a8318295766946442143',1,'operator^(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42a42be02e720782ac6d6a890f87df34',1,'operator^(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf503ce80b70d5e95589c6bcc5dcdc534',1,'operator^(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86b5ec62d72169a5af71fbef20395bf7',1,'operator^(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc0fe10ccf8bffd6a42d61a2cb7b7630',1,'operator^(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29e1fa7243c5a45d5b4a8333ef5e4ad4',1,'operator^(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace59218cd1224e9bd4e71d44effb706e',1,'operator^(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb305d044d1d79eaa26884fa8691b13c',1,'operator^(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92297263151c479220003960e6c94826',1,'operator^(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23dec7e74c18bf4befb0e357ffada712',1,'operator^(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc8b1ea1436679399d6de28a93f37c7c',1,'operator^(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cdbc34390912374b3c016740db6e5a1',1,'operator^(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga562e145a0cc65fa6571d18d0b5304fcd',1,'operator^(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1487d3dd6d9e842c3f266fdef9b3cd06',1,'operator^(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bdf640af5ef6c8037f04d2a21f72624',1,'operator^(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be79933bce514a940a915865400b1be',1,'operator^(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa8c7b4fcf0364baf63899bab7585b4',1,'operator^(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c856e8c20c27045d1016b675fea6c29',1,'operator^(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a4d4f19b1228d8c35964c9631b12db1',1,'operator^(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc9f85f2cd8647cac819333b0b5d90d2',1,'operator^(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed751d867269bace54872e57a083af43',1,'operator^(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9d23aba1973ca8fd1ea7c710c89d9c9',1,'operator^(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a5b7d75125123f6c481b6b5335baf5',1,'operator^(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1860e2d6fbcabfd958136c1d2a873565',1,'operator^(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7064aa0e201b06e6456b7225ab13b76f',1,'operator^(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182950bf07b543f15aef63a570a75740',1,'operator^(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7cb4644f2a37866175abd213e99bf9c',1,'operator^(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga106351f7f67aac5a4539cf2da429051b',1,'operator^(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5c2aa1114fc5bc919fecf84836a85bb',1,'operator^(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e81b5c59f5873a9b2b355605d4628c4',1,'operator^(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24aac76e0a255dbf62c78f3f5ac1b4d6',1,'operator^(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7de7a8c28d3b5cc29651d6128ca2d910',1,'operator^(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f1c529d765c81d140c77108626aa14a',1,'operator^(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef0821f6c671d9712c7238465f8d4884',1,'operator^(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2daad5e0b4930181e2e66c9f17f93c20',1,'operator^(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ff5a2a334e85c74b8286600064aae8b',1,'operator^(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63ccaabd5ee595473b9dc5bd77d9948e',1,'operator^(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab653e7053862a95e577b8db3322dd49c',1,'operator^(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6976070c4b0ebc9d2ac34bc7c325b112',1,'operator^(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147cb8d515df77bc9dda9bd957c21a75',1,'operator^(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8caa79576d2640d9c571dcbf39c41f9e',1,'operator^(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga536c9c60a5f68e761b71f7a521bd440f',1,'operator^(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga309e3255d388c6334fa4baccb66c39c4',1,'operator^(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga844cecceba28036b2ef12a014b0ccfb7',1,'operator^(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga930dfc19c86c269dba903a06651d79b1',1,'operator^(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc31b023630642daa958687ede735dc',1,'operator^(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga260712aebe5466a8e4f01ea498d2ca02',1,'operator^(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09aac80f9054e642a162795b850c973b',1,'operator^(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056a095b396077c1a14f6e237ba69f62',1,'operator^(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4424230c30d8785f0c7ecb0903651540',1,'operator^(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b85716ad8e68247c20bbf301d5db78b',1,'operator^(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61455fe5de691c1102ebec11128de52a',1,'operator^(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga754806ed446290afea054d4cab646e54',1,'operator^(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd6445fdc04ff5606d05f981dac957ee',1,'operator^(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3903754f858daaf6174edeec6c964db1',1,'operator^(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ae473eb2417fa915fb5d169be28d0d6',1,'operator^(uint s, const uint4 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0eec0ec1834b05e931022533e2ae4d03',1,'std::operator^()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a99429d2419718d6f9cf98153cb104a57',1,'std::regex_constants::operator^(syntax_option_type __a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ac6b912c67d2cdd494a770cd23c1b4f98',1,'std::regex_constants::operator^(match_flag_type __a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga7c9b5309fab61ddf049e350fdaa599fe',1,'std::tr2::operator^()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga7c9b5309fab61ddf049e350fdaa599fe',1,'operator^()(Global Namespace)']]], - ['operator_5e_3d_130',['operator^=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa9ac8697d02b2a3bacc58b1fa619b630',1,'std::bitset::operator^=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa9ac8697d02b2a3bacc58b1fa619b630',1,'std::bitset::operator^=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa45daae152fd32ab851c56779fc1e13c',1,'std::gslice_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga335663b1692606f8a5d96324592d4785',1,'std::indirect_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab7b73360db81555ebc04e3c482a94857',1,'std::mask_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga262449de3e39bbae18ab3bb911b2eb8b',1,'std::slice_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#adf5d449d2357108981b85b43f05114e7',1,'std::tr2::dynamic_bitset::operator^=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#adf5d449d2357108981b85b43f05114e7',1,'std::tr2::dynamic_bitset::operator^=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga12372c525f0ae4cdeb7180c7337b57ed',1,'std::valarray::operator^=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga945c098affa36e4df42895bca9937b61',1,'std::valarray::operator^=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga12372c525f0ae4cdeb7180c7337b57ed',1,'valarray< size_t >::operator^=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga945c098affa36e4df42895bca9937b61',1,'valarray< size_t >::operator^=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gadd58fb6b2720ce0e68d9665ddee198f9',1,'cv::operator^=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gadd58fb6b2720ce0e68d9665ddee198f9',1,'operator^=()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a782f3bd1b71adf5bc9f337b74ccb169d',1,'std::regex_constants::operator^=(syntax_option_type &__a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a6edeffe99c8db99f7d365da413e65c34',1,'std::regex_constants::operator^=(match_flag_type &__a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa45daae152fd32ab851c56779fc1e13c',1,'operator^=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga12372c525f0ae4cdeb7180c7337b57ed',1,'operator^=(const _Tp &)(Global Namespace)']]], - ['operatorinversesqrt_131',['operatorInverseSqrt',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#ae4b13fe4ce22faf74e50d346fc51a66e',1,'Eigen::SelfAdjointEigenSolver']]], - ['operatornorm_132',['operatorNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ff9bc0b9bea2d0822a2bf3192783102',1,'Eigen::MatrixBase::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ff9bc0b9bea2d0822a2bf3192783102',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ff9bc0b9bea2d0822a2bf3192783102',1,'MatrixBase< Solve< Decomposition, RhsType > >::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a12a7da482e31ec9c517dca92dd7bae61',1,'Eigen::SelfAdjointView::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a12a7da482e31ec9c517dca92dd7bae61',1,'SelfAdjointView< const Derived, UpLo >::operatorNorm()']]], - ['operatorsqrt_133',['operatorSqrt',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#aeeedb2ae618f21a4eb59465746c1cee5',1,'Eigen::SelfAdjointEigenSolver']]], - ['operator_7c_134',['operator|',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8938333ac6cc65c2cc4a21071b22df56',1,'cv::MatExpr::operator|(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aeac05ffd3d5c1d6c803e46a5ed380a95',1,'cv::MatExpr::operator|(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27c1238f43dfbf691c3da8b9bcbe8622',1,'cv::MatExpr::operator|(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acaa29c7d0f130d120737fcb3c5dac54d',1,'cv::MatExpr::operator|(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aab1250c235649a10a478a88394b23fda',1,'cv::MatExpr::operator|(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8938333ac6cc65c2cc4a21071b22df56',1,'cv::MatExpr::operator|(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aeac05ffd3d5c1d6c803e46a5ed380a95',1,'cv::MatExpr::operator|(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27c1238f43dfbf691c3da8b9bcbe8622',1,'cv::MatExpr::operator|(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acaa29c7d0f130d120737fcb3c5dac54d',1,'cv::MatExpr::operator|(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aab1250c235649a10a478a88394b23fda',1,'cv::MatExpr::operator|(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga08e30fb25ccd0e148c11eab8f9b0daaf',1,'cv::operator|()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72373b516825ad78e4c3db1918858a03',1,'cv::cudev::operator|(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6817a3e829bea52da01ea49c16839597',1,'cv::cudev::operator|(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b61ec46777577e1395990626361d82',1,'cv::cudev::operator|(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e5ac5a0d8c733bee304065ea5d10c5c',1,'cv::cudev::operator|(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb491ada5fa699f281393e20bad19c59',1,'cv::cudev::operator|(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga140d231543d1ec29d211aa7b6aae1f9e',1,'cv::cudev::operator|(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeec118fb2a44a56ccc4242809ef2ee45',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8765a933b0b5adf61c098fbf191a8f69',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga494eb039f25f4b355015e048e65ae92a',1,'cv::cudev::operator|(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67f56e5f79c0c5a8d35924a320e8035',1,'cv::cudev::operator|(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7e1dd96697340c2af8b08e71f65f058',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga214e51557127c9dbf5822af3b7e4086f',1,'cv::cudev::operator|(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbf444dd7ea65e673b383fdc24b7b9bc',1,'cv::cudev::operator|(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71bf7e7b2a0722518d460c2ef26bd009',1,'cv::cudev::operator|(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4c0138f513cd7e6f2ec5c673baa9430',1,'cv::cudev::operator|(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630597efc5d5a29f689f5f73b6cc2057',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79dea7d19820e4a739fb7927daff522f',1,'cv::cudev::operator|(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a62899f4dfb4a4a51fc9e18ced6b236',1,'cv::cudev::operator|(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ebd78b7e25610fdca444e53b9124af1',1,'cv::cudev::operator|(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga619519d7e0cbc71f88dcf10af8bdc3e4',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad952cc55d6204ec9648e8e226307f433',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99e794f6c32bf7a1e18e28e5cd76b3f0',1,'cv::cudev::operator|(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6285d927a8d75294be444e2923d4015d',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddeb8331934690f04aca52ec3d485468',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eae7ed305c1f6f0d697cf6b5513b52c',1,'cv::cudev::operator|(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48ef824b54938a4efab1d92d2547b6ff',1,'cv::cudev::operator|(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b91ed6a653874c97911addea7492e88',1,'cv::cudev::operator|(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a7ba688aec7b3bc93dfd03efb7a0a1',1,'cv::cudev::operator|(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0df3c76006f995c76b73f820597058d3',1,'cv::cudev::operator|(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33dc3b6cc908d682b8b4b924037462a8',1,'cv::cudev::operator|(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa67b59a7a6af82dad9017aeb8a9af3',1,'cv::cudev::operator|(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3471e18d63b852c4eb063e1ccf2a9d1',1,'cv::cudev::operator|(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e682a0014ba8daf79be5ea7b234da6f',1,'cv::cudev::operator|(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6cb1874e00d5f309b08b23fa3135867',1,'cv::cudev::operator|(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e888e4f12d42f958c274ae74b5b8fcf',1,'cv::cudev::operator|(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga926b508cb3586f7e8b26e7ab4f3a36d9',1,'cv::cudev::operator|(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga347152b541965b0706b8883c77ab59d1',1,'cv::cudev::operator|(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b428f7caf6c47e78c4ee870da69a5bb',1,'cv::cudev::operator|(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f6ed6bde6e724a15b3d462ad5fff304',1,'cv::cudev::operator|(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755c6b9eed56b86c14c166120150cf5a',1,'cv::cudev::operator|(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ac29af04d3ff28282099ae43d64c1eb',1,'cv::cudev::operator|(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5168caae872a1693252bf524ca06a971',1,'cv::cudev::operator|(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b04c7e2bf05018eff5107b8b21d834f',1,'cv::cudev::operator|(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fa19097be382eb043bc1947c99527bf',1,'cv::cudev::operator|(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dc4e4e7647a0a14bfaf036a293f7c20',1,'cv::cudev::operator|(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c4229c9c4d01aae2eb3c68b6d295a5d',1,'cv::cudev::operator|(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga089d5fc24f8caba2cd4157d4c72acd16',1,'cv::cudev::operator|(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4df0525a2ea1daa49391935fd6096f82',1,'cv::cudev::operator|(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a144b52934da855d744f0f6821ad443',1,'cv::cudev::operator|(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41753a5acd49f58734c7f0b2b906c820',1,'cv::cudev::operator|(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga066869163b1bdbd4100bdc23a675e905',1,'cv::cudev::operator|(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0631c1ac1e1d609ce0a5a20bc12d61a5',1,'cv::cudev::operator|(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64863e5f445a3cb5b5f5900dbb2d1cb6',1,'cv::cudev::operator|(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga843f54b435b967d9fcb1259ebe47d149',1,'cv::cudev::operator|(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4f44f5d07e21c6d6e891fe50f7a95c3',1,'cv::cudev::operator|(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e22900c73b91968a336722095dee82f',1,'cv::cudev::operator|(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19056ea37b866c0f7f7e47b9d1d06c56',1,'cv::cudev::operator|(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga153845e401bd20e6df63bedfaf7d7740',1,'cv::cudev::operator|(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efc7c5881e23be48037958261a0496f',1,'cv::cudev::operator|(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85a70d4dfeb3063b32cbe3db7f75cb8a',1,'cv::cudev::operator|(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga305080aaf14a3ac0997ad739d57372c7',1,'cv::cudev::operator|(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a0a8103dfd6807e20fcd226e5cd3aec',1,'cv::cudev::operator|(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14769e6c0a5b2888af00d0ceb63fc090',1,'cv::cudev::operator|(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b29a922cca4534da997e1800dbccc0f',1,'cv::cudev::operator|(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1cc5655efe72e5d9e95279d76e1d48e',1,'cv::cudev::operator|(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd8cbff79c1cace2db279f6de7a0681',1,'cv::cudev::operator|(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac38b34c8a76b66b0466166192db5d2e6',1,'cv::cudev::operator|(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236fa0260af6ef2b14fadba155fe5abe',1,'cv::cudev::operator|(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37dad1dbb748b11a1193be946b3722a1',1,'cv::cudev::operator|(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9803d4b0e3d1a0167830a72715b0c04e',1,'cv::cudev::operator|(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77b5075254d12609ad87bed4527633a4',1,'cv::cudev::operator|(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf719b791735f78195bfe29926f1b0ab7',1,'cv::cudev::operator|(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3689763321a43eacdd8d773eb2c70712',1,'cv::cudev::operator|(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572df6ef6d0112b56753ba4014881e53',1,'cv::cudev::operator|(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6457d3d1d93c0166976483a2f951ee3d',1,'cv::cudev::operator|(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91b74f2c70bcedc67c9df84a02addb79',1,'cv::cudev::operator|(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a47b495c6be9943d7cd3a7f7fd616f',1,'cv::cudev::operator|(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab07096b3294af7bcec98722b2446e479',1,'cv::cudev::operator|(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ed7b2138bc1f9497aa3c07b3dd5a07f',1,'cv::cudev::operator|(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaace76c0789620825414ff7a595ef5911',1,'cv::cudev::operator|(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6a261516077c0b79a742b166cfc07a0',1,'cv::cudev::operator|(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16512210aee4858a3ab481592bf74f1c',1,'cv::cudev::operator|(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2438bf2b14756d6e5ed3bad3b3c1e1ec',1,'cv::cudev::operator|(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ae3b6aa8f01802bd73dc969d72fabc5',1,'cv::cudev::operator|(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ead05d032040865f64cd3f8f1e0547',1,'cv::cudev::operator|(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62e550301aa3c7d81e282e7b5eb3020a',1,'cv::cudev::operator|(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac167061f4c1ca73369f88716e8989984',1,'cv::cudev::operator|(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafe49b72410fc249acf6ec30c4af1de5',1,'cv::cudev::operator|(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0385791a7e492043910a3c6d9633f1e',1,'cv::cudev::operator|(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f53c51e5f229c2d88d5820a0c1bf963',1,'cv::cudev::operator|(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef6dcabe2a6d79eb4f75768d54ddb701',1,'cv::cudev::operator|(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ccfb5c0cc94544213a31f2cca13c615',1,'cv::cudev::operator|(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32e508cfe66f331a33b2f3da6e900404',1,'cv::cudev::operator|(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga085e8a5af5cec776858566322bde16fe',1,'cv::cudev::operator|(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3050373d10dc996186ca8f35ae0d0bf',1,'cv::cudev::operator|(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24144ec0fb8b6b445ab0a1ee9e41da15',1,'cv::cudev::operator|(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga08e30fb25ccd0e148c11eab8f9b0daaf',1,'operator|(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72373b516825ad78e4c3db1918858a03',1,'operator|(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6817a3e829bea52da01ea49c16839597',1,'operator|(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b61ec46777577e1395990626361d82',1,'operator|(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e5ac5a0d8c733bee304065ea5d10c5c',1,'operator|(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb491ada5fa699f281393e20bad19c59',1,'operator|(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga140d231543d1ec29d211aa7b6aae1f9e',1,'operator|(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeec118fb2a44a56ccc4242809ef2ee45',1,'operator|(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8765a933b0b5adf61c098fbf191a8f69',1,'operator|(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga494eb039f25f4b355015e048e65ae92a',1,'operator|(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67f56e5f79c0c5a8d35924a320e8035',1,'operator|(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7e1dd96697340c2af8b08e71f65f058',1,'operator|(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga214e51557127c9dbf5822af3b7e4086f',1,'operator|(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbf444dd7ea65e673b383fdc24b7b9bc',1,'operator|(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71bf7e7b2a0722518d460c2ef26bd009',1,'operator|(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4c0138f513cd7e6f2ec5c673baa9430',1,'operator|(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630597efc5d5a29f689f5f73b6cc2057',1,'operator|(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79dea7d19820e4a739fb7927daff522f',1,'operator|(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a62899f4dfb4a4a51fc9e18ced6b236',1,'operator|(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ebd78b7e25610fdca444e53b9124af1',1,'operator|(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga619519d7e0cbc71f88dcf10af8bdc3e4',1,'operator|(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad952cc55d6204ec9648e8e226307f433',1,'operator|(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99e794f6c32bf7a1e18e28e5cd76b3f0',1,'operator|(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6285d927a8d75294be444e2923d4015d',1,'operator|(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddeb8331934690f04aca52ec3d485468',1,'operator|(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eae7ed305c1f6f0d697cf6b5513b52c',1,'operator|(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48ef824b54938a4efab1d92d2547b6ff',1,'operator|(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b91ed6a653874c97911addea7492e88',1,'operator|(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a7ba688aec7b3bc93dfd03efb7a0a1',1,'operator|(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0df3c76006f995c76b73f820597058d3',1,'operator|(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33dc3b6cc908d682b8b4b924037462a8',1,'operator|(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa67b59a7a6af82dad9017aeb8a9af3',1,'operator|(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3471e18d63b852c4eb063e1ccf2a9d1',1,'operator|(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e682a0014ba8daf79be5ea7b234da6f',1,'operator|(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6cb1874e00d5f309b08b23fa3135867',1,'operator|(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e888e4f12d42f958c274ae74b5b8fcf',1,'operator|(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga926b508cb3586f7e8b26e7ab4f3a36d9',1,'operator|(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga347152b541965b0706b8883c77ab59d1',1,'operator|(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b428f7caf6c47e78c4ee870da69a5bb',1,'operator|(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f6ed6bde6e724a15b3d462ad5fff304',1,'operator|(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755c6b9eed56b86c14c166120150cf5a',1,'operator|(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ac29af04d3ff28282099ae43d64c1eb',1,'operator|(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5168caae872a1693252bf524ca06a971',1,'operator|(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b04c7e2bf05018eff5107b8b21d834f',1,'operator|(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fa19097be382eb043bc1947c99527bf',1,'operator|(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dc4e4e7647a0a14bfaf036a293f7c20',1,'operator|(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c4229c9c4d01aae2eb3c68b6d295a5d',1,'operator|(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga089d5fc24f8caba2cd4157d4c72acd16',1,'operator|(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4df0525a2ea1daa49391935fd6096f82',1,'operator|(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a144b52934da855d744f0f6821ad443',1,'operator|(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41753a5acd49f58734c7f0b2b906c820',1,'operator|(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga066869163b1bdbd4100bdc23a675e905',1,'operator|(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0631c1ac1e1d609ce0a5a20bc12d61a5',1,'operator|(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64863e5f445a3cb5b5f5900dbb2d1cb6',1,'operator|(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga843f54b435b967d9fcb1259ebe47d149',1,'operator|(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4f44f5d07e21c6d6e891fe50f7a95c3',1,'operator|(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e22900c73b91968a336722095dee82f',1,'operator|(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19056ea37b866c0f7f7e47b9d1d06c56',1,'operator|(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga153845e401bd20e6df63bedfaf7d7740',1,'operator|(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efc7c5881e23be48037958261a0496f',1,'operator|(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85a70d4dfeb3063b32cbe3db7f75cb8a',1,'operator|(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga305080aaf14a3ac0997ad739d57372c7',1,'operator|(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a0a8103dfd6807e20fcd226e5cd3aec',1,'operator|(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14769e6c0a5b2888af00d0ceb63fc090',1,'operator|(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b29a922cca4534da997e1800dbccc0f',1,'operator|(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1cc5655efe72e5d9e95279d76e1d48e',1,'operator|(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd8cbff79c1cace2db279f6de7a0681',1,'operator|(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac38b34c8a76b66b0466166192db5d2e6',1,'operator|(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236fa0260af6ef2b14fadba155fe5abe',1,'operator|(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37dad1dbb748b11a1193be946b3722a1',1,'operator|(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9803d4b0e3d1a0167830a72715b0c04e',1,'operator|(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77b5075254d12609ad87bed4527633a4',1,'operator|(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf719b791735f78195bfe29926f1b0ab7',1,'operator|(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3689763321a43eacdd8d773eb2c70712',1,'operator|(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572df6ef6d0112b56753ba4014881e53',1,'operator|(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6457d3d1d93c0166976483a2f951ee3d',1,'operator|(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91b74f2c70bcedc67c9df84a02addb79',1,'operator|(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a47b495c6be9943d7cd3a7f7fd616f',1,'operator|(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab07096b3294af7bcec98722b2446e479',1,'operator|(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ed7b2138bc1f9497aa3c07b3dd5a07f',1,'operator|(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaace76c0789620825414ff7a595ef5911',1,'operator|(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6a261516077c0b79a742b166cfc07a0',1,'operator|(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16512210aee4858a3ab481592bf74f1c',1,'operator|(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2438bf2b14756d6e5ed3bad3b3c1e1ec',1,'operator|(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ae3b6aa8f01802bd73dc969d72fabc5',1,'operator|(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ead05d032040865f64cd3f8f1e0547',1,'operator|(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62e550301aa3c7d81e282e7b5eb3020a',1,'operator|(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac167061f4c1ca73369f88716e8989984',1,'operator|(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafe49b72410fc249acf6ec30c4af1de5',1,'operator|(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0385791a7e492043910a3c6d9633f1e',1,'operator|(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f53c51e5f229c2d88d5820a0c1bf963',1,'operator|(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef6dcabe2a6d79eb4f75768d54ddb701',1,'operator|(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ccfb5c0cc94544213a31f2cca13c615',1,'operator|(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32e508cfe66f331a33b2f3da6e900404',1,'operator|(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga085e8a5af5cec776858566322bde16fe',1,'operator|(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3050373d10dc996186ca8f35ae0d0bf',1,'operator|(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24144ec0fb8b6b445ab0a1ee9e41da15',1,'operator|(const uint3 &a, uint s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a37b7f9acb3d4f471410857a524425f03',1,'std::operator|()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#aed34b3d93916973cfea2af94c22ac505',1,'std::regex_constants::operator|(syntax_option_type __a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a510d0810f0fe55a65a1f3ad142e95e2c',1,'std::regex_constants::operator|(match_flag_type __a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gad20c154d9a0dc8523781b0d2fe0d3de1',1,'std::tr2::operator|()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gad20c154d9a0dc8523781b0d2fe0d3de1',1,'operator|()(Global Namespace)']]], - ['operator_7c_3d_135',['operator|=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a75853927c9ad1aa9548e9eea7fde188c',1,'std::bitset::operator|=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a75853927c9ad1aa9548e9eea7fde188c',1,'std::bitset::operator|=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga87a6054e3d3df9b3b828c86d7b71a7d0',1,'std::gslice_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga349500cff6b300c39a505e9c74943b86',1,'std::indirect_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga684708f251addb2566756f4d2eedee36',1,'std::mask_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0cfe83bfd0c60d5f1b393bbddcc70889',1,'std::slice_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a4db104deaf30025db9b8064f29fa29f8',1,'std::tr2::dynamic_bitset::operator|=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a4db104deaf30025db9b8064f29fa29f8',1,'std::tr2::dynamic_bitset::operator|=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf20cc6bf249d338dd1fdb26f4363ee2e',1,'std::valarray::operator|=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2082939513c0702ce488c2dc27e98951',1,'std::valarray::operator|=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf20cc6bf249d338dd1fdb26f4363ee2e',1,'valarray< size_t >::operator|=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2082939513c0702ce488c2dc27e98951',1,'valarray< size_t >::operator|=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaad93bb02fc5c3c4c248b1dbb8a7348fe',1,'cv::operator|=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaad93bb02fc5c3c4c248b1dbb8a7348fe',1,'operator|=()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a4bd5dcfb1f0eead5b8f66233f45638f4',1,'std::regex_constants::operator|=(syntax_option_type &__a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a1cc70d79ada227928c10a6ae955a5527',1,'std::regex_constants::operator|=(match_flag_type &__a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga87a6054e3d3df9b3b828c86d7b71a7d0',1,'operator|=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf20cc6bf249d338dd1fdb26f4363ee2e',1,'operator|=(const _Tp &)(Global Namespace)']]], - ['operator_7c_7c_136',['operator||',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade405ae7fba00188385f79da087b473d',1,'cv::cudev::operator||(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67336d4da1a1a0e097576e110e322d17',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d9325273f75ec46a5d0ccaa698dcab2',1,'cv::cudev::operator||(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a350991d905802482a4a52516296256',1,'cv::cudev::operator||(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd38e92dca97e14285cb0a994eac2eb2',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1cf8719bfe35c1ce58b69439440ebb',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga407966ca821a5b21a0fa3669273ce155',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3f1b3a6297712114fb1528180bf4d5d',1,'cv::cudev::operator||(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa60211ccc7148f580c9213f98d57d852',1,'cv::cudev::operator||(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc492c09a30238356c29f992f434bbb',1,'cv::cudev::operator||(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab229fbb04aea1adaf4ad5a99495035b9',1,'cv::cudev::operator||(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac068c500d749dcf1c1b633a71343bf64',1,'cv::cudev::operator||(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfceb475fab9bf020cc18a7d00ce68fa',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga970bfbba082e36b082ec64f178fa4bc4',1,'cv::cudev::operator||(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451cabb9165a8cb76c8b8281a48a74c3',1,'cv::cudev::operator||(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ed51988f3b066b935628ca0ca76c806',1,'cv::cudev::operator||(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56be341fd82bc471dc3727ac767df94d',1,'cv::cudev::operator||(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43139046dc0327bc12a3405a63c93e78',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga759c70e663c4ff4e8d2ae8217d47a7d7',1,'cv::cudev::operator||(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64af392441e02098f668b91b581d6158',1,'cv::cudev::operator||(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9dfe768a49878db05bdb91ebe5a8759b',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga292fb2e70406a170f98347e3d2110db8',1,'cv::cudev::operator||(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20d93bcf778f16d1853957cc42ff9eab',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce18a713dc4adf2e6fc8841b69a7639',1,'cv::cudev::operator||(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf45510b81f8e1759112cecd4b5a4aa3',1,'cv::cudev::operator||(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fe1c8b48957c39413aac5e3ffd90376',1,'cv::cudev::operator||(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b56bd1f805e2cc2a433d784ea26764b',1,'cv::cudev::operator||(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51f6411482c1c1dc459307997d262caa',1,'cv::cudev::operator||(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae01ca019d7b9f4b726b7017dccfb97eb',1,'cv::cudev::operator||(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c9b224b12822bc42b33d5371cf7cef4',1,'cv::cudev::operator||(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdb8f03f5e8aded2d1c1f5b674f8d0be',1,'cv::cudev::operator||(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga682b9e8e6d24725fbfd14afe04c746cc',1,'cv::cudev::operator||(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f2c04274bc2e9ef0c0e64e835272570',1,'cv::cudev::operator||(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9613bf79ecb44e0124d987c0dc603c0e',1,'cv::cudev::operator||(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96c371efcc9fa6314c3997cabac8de8e',1,'cv::cudev::operator||(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebbcb4c326b4d6504cd9400ac933f53e',1,'cv::cudev::operator||(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6a798890ec4e1c957610419cbc07fa3',1,'cv::cudev::operator||(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0637cf031452de7f45462f4cf7d20f0',1,'cv::cudev::operator||(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3532b09926ae239bbfdcb638f8602895',1,'cv::cudev::operator||(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga625848bfaa38a86a0132a1771535fddb',1,'cv::cudev::operator||(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c08c399ce28a20e5849c10236e3ec1e',1,'cv::cudev::operator||(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga446ac73d6fc9c701bf235f9530e05486',1,'cv::cudev::operator||(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bdb1e714d4966bc3b89850c3f223aa6',1,'cv::cudev::operator||(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d607a72c6d5edbf0c5f0defadeecfe9',1,'cv::cudev::operator||(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc57b8d10acf24138375fc21e1799aeb',1,'cv::cudev::operator||(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b65fb035d930940ab0736ddbc0519fc',1,'cv::cudev::operator||(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1593e87e954982987925c25988dab81a',1,'cv::cudev::operator||(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0b4e24f07cae0bd5ef2032f1895b44',1,'cv::cudev::operator||(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb0588dab343533c00fe007f4e019f29',1,'cv::cudev::operator||(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7db7c5c12deeb79a3ad18e230fd0028',1,'cv::cudev::operator||(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99d4f17ca75885550288386f0959cfa5',1,'cv::cudev::operator||(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56bd222aa931f4a2f6c330e6e49ed71c',1,'cv::cudev::operator||(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53fea0cb9bdf3c6ad83ef37fe04f24dc',1,'cv::cudev::operator||(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c523f9819c7a99755990d8ed6b08504',1,'cv::cudev::operator||(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga093ad1e54e64a7cccf3782b2410172e3',1,'cv::cudev::operator||(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3bb180e11c140a1860d1c7282f3f4c5',1,'cv::cudev::operator||(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcd6bed19993a3dec96454714e056e3c',1,'cv::cudev::operator||(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8d59bf11b4243a05cd6cc3456fa3278',1,'cv::cudev::operator||(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga035765656c86485e88a7ffeedff10886',1,'cv::cudev::operator||(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c72b384daef54b49c99c95bb6e5d236',1,'cv::cudev::operator||(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac790b4177372769ebcb41bf113cc07d8',1,'cv::cudev::operator||(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444bdacd77a60792457a032271d6d8cc',1,'cv::cudev::operator||(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41de5b9e5a723be85cb439a1c08f7ce9',1,'cv::cudev::operator||(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5f81c65260b22ae9af48906f448382',1,'cv::cudev::operator||(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28d8dab796f6cc5d9efbba9a4a140d4',1,'cv::cudev::operator||(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32f816f6e9ef55e8af7d1076b934d769',1,'cv::cudev::operator||(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae58e21e5c4f719ccbeff08445d7c6fdc',1,'cv::cudev::operator||(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57922b91c42d3f3ec0d95961bb252c2a',1,'cv::cudev::operator||(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bd2ec7511fa65af12e0c31e7eca6cf1',1,'cv::cudev::operator||(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad435bf12fa84bd6238bd536719b8a55d',1,'cv::cudev::operator||(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace641577e19ea3b0204727ec67a54b77',1,'cv::cudev::operator||(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3ed13bdecfdf8509917b6128cbdd7b',1,'cv::cudev::operator||(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a42dd360c68ec429b3a9abd29792217',1,'cv::cudev::operator||(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62831716f60762daf6bdc34ba4563a5b',1,'cv::cudev::operator||(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eb7dc78006628d46caf362876324bfd',1,'cv::cudev::operator||(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95813948539b789f7529edc7fec1b313',1,'cv::cudev::operator||(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391980191d7c6907415884f3893e4622',1,'cv::cudev::operator||(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab52b978af7010683e959b7f5961f609c',1,'cv::cudev::operator||(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3c33ae535cb54e41e989a2e26834450',1,'cv::cudev::operator||(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed613e1f82f7862a55e3133e0b2ea94b',1,'cv::cudev::operator||(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c9970228fa884a956021c0cebfe15e5',1,'cv::cudev::operator||(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc178b7c15f18971eb20fffbb9a887a7',1,'cv::cudev::operator||(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d5361965c51f7ca2fe416200eb560d7',1,'cv::cudev::operator||(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487430a598578322fad0872d8e6ea35',1,'cv::cudev::operator||(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f85d3d5f36760dd63779885fef347fc',1,'cv::cudev::operator||(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0716b8368db9bfe6147ff620abcaf320',1,'cv::cudev::operator||(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3592b47fa7aa798a21f19a79a3a2d',1,'cv::cudev::operator||(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86fa4d24a51bc0fdb27624637e4162e7',1,'cv::cudev::operator||(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb7e65838ac0a9b1d7beac8bbf01b0e1',1,'cv::cudev::operator||(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9feff133da5c0cb798cc33b19fbd9ed2',1,'cv::cudev::operator||(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0995ff62918197fe40f2bea8e2b37898',1,'cv::cudev::operator||(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14791b0a2e98ba50d90b77b9d63768c3',1,'cv::cudev::operator||(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae3e389c0e99795f9a710bd9d7cd7893',1,'cv::cudev::operator||(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac554616aa3c8e0f521084e7fdffb3338',1,'cv::cudev::operator||(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e998efb0b51d4b11c8166bc17652e8f',1,'cv::cudev::operator||(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff58076f49066c7da5f88773b94eccca',1,'cv::cudev::operator||(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa98a4d1808e3e161362ed3709ac3b76f',1,'cv::cudev::operator||(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630796daa4fa81bd3480cccdd6208ce0',1,'cv::cudev::operator||(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1608d98a47346871d348ee3148a07c1a',1,'cv::cudev::operator||(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab756a072938395df21755c1b6a904d',1,'cv::cudev::operator||(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff73a5437bdeffdeb0b0c679cf39443b',1,'cv::cudev::operator||(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2b6b4c57ef47d6c51cc19656e57dc0',1,'cv::cudev::operator||(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ae692a8fbb489bb9e1745d7065fa41f',1,'cv::cudev::operator||(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee77151b150eacdfbd738bbd951de91',1,'cv::cudev::operator||(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7bb01e03b921b536c9de83900f120cb',1,'cv::cudev::operator||(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb998884b15432012259b70ee9eff749',1,'cv::cudev::operator||(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6139801e245820e8d980eb9fa19227ae',1,'cv::cudev::operator||(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba01bc6fa2a85a61bc572ee53396c0d',1,'cv::cudev::operator||(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8dc5f6ba926a32a8bb43a71f974f71f3',1,'cv::cudev::operator||(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5cd0e8199aa6ece5c42b6d469df866d',1,'cv::cudev::operator||(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3283fe040cbd0280fae5affaa5a577c3',1,'cv::cudev::operator||(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30c84efa97656970fb477d1ac42a077a',1,'cv::cudev::operator||(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae96a32168030467d5053c0f8bda7dd1b',1,'cv::cudev::operator||(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89385a5dbfdb1ef20b2e838ad9ec15cd',1,'cv::cudev::operator||(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fafcbb93a3a84b83a0d2d4e0609100d',1,'cv::cudev::operator||(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga848a2952f43a7226971f5d2426afbc8a',1,'cv::cudev::operator||(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf9201cd6a194985ee8dc16efad11954',1,'cv::cudev::operator||(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba6a7eed88b7ef37db22ace6732f6174',1,'cv::cudev::operator||(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44648e106e79365765d8081617546291',1,'cv::cudev::operator||(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a03a718dffc89a29648a361f61ba315',1,'cv::cudev::operator||(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade405ae7fba00188385f79da087b473d',1,'operator||(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67336d4da1a1a0e097576e110e322d17',1,'operator||(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d9325273f75ec46a5d0ccaa698dcab2',1,'operator||(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a350991d905802482a4a52516296256',1,'operator||(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd38e92dca97e14285cb0a994eac2eb2',1,'operator||(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1cf8719bfe35c1ce58b69439440ebb',1,'operator||(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga407966ca821a5b21a0fa3669273ce155',1,'operator||(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3f1b3a6297712114fb1528180bf4d5d',1,'operator||(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa60211ccc7148f580c9213f98d57d852',1,'operator||(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc492c09a30238356c29f992f434bbb',1,'operator||(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab229fbb04aea1adaf4ad5a99495035b9',1,'operator||(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac068c500d749dcf1c1b633a71343bf64',1,'operator||(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfceb475fab9bf020cc18a7d00ce68fa',1,'operator||(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga970bfbba082e36b082ec64f178fa4bc4',1,'operator||(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451cabb9165a8cb76c8b8281a48a74c3',1,'operator||(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ed51988f3b066b935628ca0ca76c806',1,'operator||(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56be341fd82bc471dc3727ac767df94d',1,'operator||(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43139046dc0327bc12a3405a63c93e78',1,'operator||(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga759c70e663c4ff4e8d2ae8217d47a7d7',1,'operator||(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64af392441e02098f668b91b581d6158',1,'operator||(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9dfe768a49878db05bdb91ebe5a8759b',1,'operator||(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga292fb2e70406a170f98347e3d2110db8',1,'operator||(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20d93bcf778f16d1853957cc42ff9eab',1,'operator||(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce18a713dc4adf2e6fc8841b69a7639',1,'operator||(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf45510b81f8e1759112cecd4b5a4aa3',1,'operator||(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fe1c8b48957c39413aac5e3ffd90376',1,'operator||(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b56bd1f805e2cc2a433d784ea26764b',1,'operator||(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51f6411482c1c1dc459307997d262caa',1,'operator||(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae01ca019d7b9f4b726b7017dccfb97eb',1,'operator||(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c9b224b12822bc42b33d5371cf7cef4',1,'operator||(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdb8f03f5e8aded2d1c1f5b674f8d0be',1,'operator||(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga682b9e8e6d24725fbfd14afe04c746cc',1,'operator||(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f2c04274bc2e9ef0c0e64e835272570',1,'operator||(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9613bf79ecb44e0124d987c0dc603c0e',1,'operator||(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96c371efcc9fa6314c3997cabac8de8e',1,'operator||(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebbcb4c326b4d6504cd9400ac933f53e',1,'operator||(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6a798890ec4e1c957610419cbc07fa3',1,'operator||(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0637cf031452de7f45462f4cf7d20f0',1,'operator||(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3532b09926ae239bbfdcb638f8602895',1,'operator||(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga625848bfaa38a86a0132a1771535fddb',1,'operator||(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c08c399ce28a20e5849c10236e3ec1e',1,'operator||(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga446ac73d6fc9c701bf235f9530e05486',1,'operator||(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bdb1e714d4966bc3b89850c3f223aa6',1,'operator||(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d607a72c6d5edbf0c5f0defadeecfe9',1,'operator||(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc57b8d10acf24138375fc21e1799aeb',1,'operator||(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b65fb035d930940ab0736ddbc0519fc',1,'operator||(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1593e87e954982987925c25988dab81a',1,'operator||(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0b4e24f07cae0bd5ef2032f1895b44',1,'operator||(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb0588dab343533c00fe007f4e019f29',1,'operator||(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7db7c5c12deeb79a3ad18e230fd0028',1,'operator||(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99d4f17ca75885550288386f0959cfa5',1,'operator||(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56bd222aa931f4a2f6c330e6e49ed71c',1,'operator||(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53fea0cb9bdf3c6ad83ef37fe04f24dc',1,'operator||(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c523f9819c7a99755990d8ed6b08504',1,'operator||(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga093ad1e54e64a7cccf3782b2410172e3',1,'operator||(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3bb180e11c140a1860d1c7282f3f4c5',1,'operator||(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcd6bed19993a3dec96454714e056e3c',1,'operator||(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8d59bf11b4243a05cd6cc3456fa3278',1,'operator||(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga035765656c86485e88a7ffeedff10886',1,'operator||(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c72b384daef54b49c99c95bb6e5d236',1,'operator||(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac790b4177372769ebcb41bf113cc07d8',1,'operator||(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444bdacd77a60792457a032271d6d8cc',1,'operator||(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41de5b9e5a723be85cb439a1c08f7ce9',1,'operator||(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5f81c65260b22ae9af48906f448382',1,'operator||(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28d8dab796f6cc5d9efbba9a4a140d4',1,'operator||(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32f816f6e9ef55e8af7d1076b934d769',1,'operator||(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae58e21e5c4f719ccbeff08445d7c6fdc',1,'operator||(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57922b91c42d3f3ec0d95961bb252c2a',1,'operator||(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bd2ec7511fa65af12e0c31e7eca6cf1',1,'operator||(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad435bf12fa84bd6238bd536719b8a55d',1,'operator||(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace641577e19ea3b0204727ec67a54b77',1,'operator||(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3ed13bdecfdf8509917b6128cbdd7b',1,'operator||(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a42dd360c68ec429b3a9abd29792217',1,'operator||(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62831716f60762daf6bdc34ba4563a5b',1,'operator||(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eb7dc78006628d46caf362876324bfd',1,'operator||(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95813948539b789f7529edc7fec1b313',1,'operator||(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391980191d7c6907415884f3893e4622',1,'operator||(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab52b978af7010683e959b7f5961f609c',1,'operator||(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3c33ae535cb54e41e989a2e26834450',1,'operator||(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed613e1f82f7862a55e3133e0b2ea94b',1,'operator||(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c9970228fa884a956021c0cebfe15e5',1,'operator||(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc178b7c15f18971eb20fffbb9a887a7',1,'operator||(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d5361965c51f7ca2fe416200eb560d7',1,'operator||(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487430a598578322fad0872d8e6ea35',1,'operator||(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f85d3d5f36760dd63779885fef347fc',1,'operator||(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0716b8368db9bfe6147ff620abcaf320',1,'operator||(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3592b47fa7aa798a21f19a79a3a2d',1,'operator||(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86fa4d24a51bc0fdb27624637e4162e7',1,'operator||(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb7e65838ac0a9b1d7beac8bbf01b0e1',1,'operator||(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9feff133da5c0cb798cc33b19fbd9ed2',1,'operator||(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0995ff62918197fe40f2bea8e2b37898',1,'operator||(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14791b0a2e98ba50d90b77b9d63768c3',1,'operator||(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae3e389c0e99795f9a710bd9d7cd7893',1,'operator||(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac554616aa3c8e0f521084e7fdffb3338',1,'operator||(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e998efb0b51d4b11c8166bc17652e8f',1,'operator||(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff58076f49066c7da5f88773b94eccca',1,'operator||(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa98a4d1808e3e161362ed3709ac3b76f',1,'operator||(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630796daa4fa81bd3480cccdd6208ce0',1,'operator||(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1608d98a47346871d348ee3148a07c1a',1,'operator||(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab756a072938395df21755c1b6a904d',1,'operator||(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff73a5437bdeffdeb0b0c679cf39443b',1,'operator||(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2b6b4c57ef47d6c51cc19656e57dc0',1,'operator||(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ae692a8fbb489bb9e1745d7065fa41f',1,'operator||(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee77151b150eacdfbd738bbd951de91',1,'operator||(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7bb01e03b921b536c9de83900f120cb',1,'operator||(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb998884b15432012259b70ee9eff749',1,'operator||(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6139801e245820e8d980eb9fa19227ae',1,'operator||(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba01bc6fa2a85a61bc572ee53396c0d',1,'operator||(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8dc5f6ba926a32a8bb43a71f974f71f3',1,'operator||(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5cd0e8199aa6ece5c42b6d469df866d',1,'operator||(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3283fe040cbd0280fae5affaa5a577c3',1,'operator||(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30c84efa97656970fb477d1ac42a077a',1,'operator||(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae96a32168030467d5053c0f8bda7dd1b',1,'operator||(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89385a5dbfdb1ef20b2e838ad9ec15cd',1,'operator||(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fafcbb93a3a84b83a0d2d4e0609100d',1,'operator||(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga848a2952f43a7226971f5d2426afbc8a',1,'operator||(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf9201cd6a194985ee8dc16efad11954',1,'operator||(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba6a7eed88b7ef37db22ace6732f6174',1,'operator||(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44648e106e79365765d8081617546291',1,'operator||(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a03a718dffc89a29648a361f61ba315',1,'operator||(const double2 &a, double s)(Global Namespace)']]], - ['operator_7e_137',['operator~',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69ba8f5d451de974d9aa514cdbbb1120',1,'cv::MatExpr::operator~(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69ba8f5d451de974d9aa514cdbbb1120',1,'cv::MatExpr::operator~(const Mat &m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a2cdeed3169c5dbfd617f68bbef6457ee',1,'std::bitset::operator~()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aed8f061579e182d2d8249f37a11de6c4',1,'std::tr2::dynamic_bitset::operator~()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga88b2ec0fbd1864a99c09d24f5b39e16d',1,'std::valarray::operator~()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga88b2ec0fbd1864a99c09d24f5b39e16d',1,'valarray< size_t >::operator~()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6238e30480f4a52f3b30d5c21bbbadb1',1,'cv::operator~()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf198524c2b506a2c29566cf7c9ae5e19',1,'cv::cudev::operator~(const Expr< Body > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf5b7bc46f1c4ffac38c938fdbea0d16',1,'cv::cudev::operator~(const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4618266096d4f1e47a4cd6967fb84fc3',1,'cv::cudev::operator~(const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8deb59fd638ca954bbdaf55f76a897',1,'cv::cudev::operator~(const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3055d07443d2275c1d12b97bdf297fce',1,'cv::cudev::operator~(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c754a9105964639a463dadebfa4176',1,'cv::cudev::operator~(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d4f587e0787e85c7237f061c7f5629',1,'cv::cudev::operator~(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77e7214b716a6e24b6c0ad5100723acb',1,'cv::cudev::operator~(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa20f0d48b258a29f1f78dc3bcd155f2',1,'cv::cudev::operator~(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bb7b251d40b57f97ee8761816827d5f',1,'cv::cudev::operator~(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cca9e55f0124be8c28f031dde68ff82',1,'cv::cudev::operator~(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga838e1acadd4adf72d05375901877406a',1,'cv::cudev::operator~(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8c1a39515d09b32e3d25441c5cd129a',1,'cv::cudev::operator~(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf372f82a0e3f18ff74490509c8fb3600',1,'cv::cudev::operator~(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga077d19d04f77129e7fdb284d42bc78ee',1,'cv::cudev::operator~(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa789cd510fcff4984885dcdfbb618018',1,'cv::cudev::operator~(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7d9565b8e27201dbcefa113a9c16c8',1,'cv::cudev::operator~(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga861b8704201b4e6e2d55a9abd798161a',1,'cv::cudev::operator~(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195352c298ca60f9f1427d993b5aeb6c',1,'cv::cudev::operator~(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa4e3b79d78611d2031c8d21420d4ab',1,'cv::cudev::operator~(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133c3fb71ea8172a37867390be557400',1,'cv::cudev::operator~(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7d6682dd37b7ea68625ab7a1b693926',1,'cv::cudev::operator~(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9cb1d6029d987bdbd57fb47193ee591',1,'cv::cudev::operator~(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1e50a02cb728d3a0a936c6239263d0',1,'cv::cudev::operator~(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79cc15f84516fa21851f6c9748497891',1,'cv::cudev::operator~(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37a2be39fcfb682e1e91697df152cdd3',1,'cv::cudev::operator~(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8e1f246e66d56a7a4315f926d64938e',1,'cv::cudev::operator~(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecbd81337a2a8039c93dc0f6b7f322d4',1,'cv::cudev::operator~(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6238e30480f4a52f3b30d5c21bbbadb1',1,'operator~(const v_reg< _Tp, n > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf198524c2b506a2c29566cf7c9ae5e19',1,'operator~(const Expr< Body > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf5b7bc46f1c4ffac38c938fdbea0d16',1,'operator~(const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4618266096d4f1e47a4cd6967fb84fc3',1,'operator~(const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8deb59fd638ca954bbdaf55f76a897',1,'operator~(const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3055d07443d2275c1d12b97bdf297fce',1,'operator~(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c754a9105964639a463dadebfa4176',1,'operator~(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d4f587e0787e85c7237f061c7f5629',1,'operator~(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77e7214b716a6e24b6c0ad5100723acb',1,'operator~(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa20f0d48b258a29f1f78dc3bcd155f2',1,'operator~(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bb7b251d40b57f97ee8761816827d5f',1,'operator~(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cca9e55f0124be8c28f031dde68ff82',1,'operator~(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga838e1acadd4adf72d05375901877406a',1,'operator~(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8c1a39515d09b32e3d25441c5cd129a',1,'operator~(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf372f82a0e3f18ff74490509c8fb3600',1,'operator~(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga077d19d04f77129e7fdb284d42bc78ee',1,'operator~(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa789cd510fcff4984885dcdfbb618018',1,'operator~(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7d9565b8e27201dbcefa113a9c16c8',1,'operator~(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga861b8704201b4e6e2d55a9abd798161a',1,'operator~(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195352c298ca60f9f1427d993b5aeb6c',1,'operator~(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa4e3b79d78611d2031c8d21420d4ab',1,'operator~(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133c3fb71ea8172a37867390be557400',1,'operator~(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7d6682dd37b7ea68625ab7a1b693926',1,'operator~(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9cb1d6029d987bdbd57fb47193ee591',1,'operator~(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1e50a02cb728d3a0a936c6239263d0',1,'operator~(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79cc15f84516fa21851f6c9748497891',1,'operator~(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37a2be39fcfb682e1e91697df152cdd3',1,'operator~(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8e1f246e66d56a7a4315f926d64938e',1,'operator~(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecbd81337a2a8039c93dc0f6b7f322d4',1,'operator~(const uint1 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ad3de70b7c5c74267276903c86628e239',1,'std::regex_constants::operator~(syntax_option_type __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a2aeb16521b6691e19cb344505b084271',1,'std::regex_constants::operator~(match_flag_type __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga88b2ec0fbd1864a99c09d24f5b39e16d',1,'operator~()(Global Namespace)']]], - ['oplandiplparvoparameters_138',['OPLandIplParvoParameters',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#a397e52e1f6738f907169910800c6aae7',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], - ['optflowestimator_139',['optFlowEstimator',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#a2febcdca26690c112002949348ade823',1,'cv::videostab::MotionInpainter']]], - ['opticalflowestimator_140',['opticalFlowEstimator',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a490cd8c016f7b4d181daedb55eec28e9',1,'cv::videostab::KeypointBasedMotionEstimator']]], - ['opticalflowpcaflow_141',['OpticalFlowPCAFlow',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#afe6dd4b33d08e519a8ef2d0798564040',1,'cv::optflow::OpticalFlowPCAFlow']]], - ['optimizeextrinsics_142',['optimizeExtrinsics',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#ac4c4d52808b8878e134c22c09e0b5717',1,'cv::multicalib::MultiCameraCalibration']]], - ['optional_143',['optional',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#ab22465abe81369037764c6ac1b799273',1,'cv::util::optional::optional()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a09eaedc3d5761ccc237a213e6f4f8d94',1,'cv::util::optional::optional(const optional &)=default'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#aad5e2bf28fd67eac2c683e189d25f9e0',1,'cv::util::optional::optional(T &&value) noexcept'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a63127f3a74565eec28548a24e18c2716',1,'cv::util::optional::optional(const T &value) noexcept'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#ab7e3745f571967e65d36bc7eeb640d7f',1,'cv::util::optional::optional(optional &&) noexcept']]], - ['optional_5flock_5fguard_144',['optional_lock_guard',['https://docs.opencv.org/4.2.0/d3/de8/classcv_1_1utils_1_1optional__lock__guard.html#a8a7a28c1f9a4153a89b806ce065106e1',1,'cv::utils::optional_lock_guard']]], - ['optional_5fshared_5flock_5fguard_145',['optional_shared_lock_guard',['https://docs.opencv.org/4.2.0/d2/ddd/classcv_1_1utils_1_1optional__shared__lock__guard.html#a87856795a393a792d0588da931a6f6d6',1,'cv::utils::optional_shared_lock_guard']]], - ['options_146',['options',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a42d9d79073379f1e75b0f2c49879ed5b',1,'Eigen::SuperLUBase::options()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a42d9d79073379f1e75b0f2c49879ed5b',1,'SuperLUBase< _MatrixType, SuperILU< _MatrixType > >::options()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a42d9d79073379f1e75b0f2c49879ed5b',1,'SuperLUBase< _MatrixType, SuperLU< _MatrixType > >::options()']]], - ['or8u_147',['or8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabe8e8d763760f73eb41f9b555b92a6a3',1,'cv::hal::or8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabe8e8d763760f73eb41f9b555b92a6a3',1,'or8u()(Global Namespace)']]], - ['orange_148',['orange',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1a1069a4fd84db013399ffc68c202901',1,'cv::viz::Color']]], - ['orange_5fred_149',['orange_red',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a6d78c79310b79a16fd8100b80d50aeef',1,'cv::viz::Color']]], - ['order_5fof_5fkey_150',['order_of_key',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#a1c33a80afedc268c76b5ad8468fb84ee',1,'__gnu_pbds::tree_order_statistics_node_update::order_of_key()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#afc18e57812078123f3fb91a1148ec5f5',1,'__gnu_pbds::trie_order_statistics_node_update::order_of_key(key_const_reference) const']]], - ['order_5fof_5fprefix_151',['order_of_prefix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#a5baafac1f227b055faf0f836ccf166fc',1,'__gnu_pbds::trie_order_statistics_node_update']]], - ['ordered_5fmap_152',['ordered_map',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a87938c10b76510dac00412d2cb5fd1e4.html#a87938c10b76510dac00412d2cb5fd1e4',1,'nlohmann::ordered_map::ordered_map(const Allocator &alloc=Allocator())'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a9d25efb51325cc1be027b8ea00c1f8b8.html#a9d25efb51325cc1be027b8ea00c1f8b8',1,'nlohmann::ordered_map::ordered_map(It first, It last, const Allocator &alloc=Allocator())'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a0482ea79e7786367a2d9b5c789c091ce.html#a0482ea79e7786367a2d9b5c789c091ce',1,'nlohmann::ordered_map::ordered_map(std::initializer_list< T > init, const Allocator &alloc=Allocator())']]], - ['ostream_5fiterator_153',['ostream_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a43b5a82905d5237921fc78c44455950a',1,'std::ostream_iterator::ostream_iterator(ostream_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#afa776b7965fc2d27f9281944542be2d8',1,'std::ostream_iterator::ostream_iterator(ostream_type &__s, const _CharT *__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a6f93dbe2e9972260dd0ab4b869967e26',1,'std::ostream_iterator::ostream_iterator(const ostream_iterator &__obj)']]], - ['ostreambuf_5fiterator_154',['ostreambuf_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ac9080f23edb16ede8dc2e24e84f75207',1,'std::ostreambuf_iterator::ostreambuf_iterator(ostream_type &__s) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#aef4876e87478fee9493302260f2c1b36',1,'std::ostreambuf_iterator::ostreambuf_iterator(streambuf_type *__s) noexcept']]], - ['out_155',['out',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< _InternT, _ExternT, encoding_state >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< char, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< char16_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< char32_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< wchar_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'codecvt< _Elem, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::__codecvt_abstract_base::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< _InternT, _ExternT, encoding_state >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< char, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< char16_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< char32_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< wchar_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt_byname::out()']]], - ['outer_156',['outer',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Eigen::Stride::outer()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Stride< 0, Value >::outer()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::outer()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Stride< Value, 0 >::outer()']]], - ['outerindexptr_157',['outerIndexPtr',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'Eigen::SparseCompressedBase::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'Eigen::SparseCompressedBase::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Derived >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Derived >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Transpose< MatrixType > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Transpose< MatrixType > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a24c55dd8de4aca30e7c90b69aa5dca6b',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html#a3b74af754254837fc591cd9936688b95',1,'Eigen::SparseMapBase< Derived, WriteAccessors >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'Eigen::SparseMatrix::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'Eigen::SparseMatrix::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar, ColMajor, int >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar, ColMajor, int >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::outerIndexPtr() const']]], - ['outersize_158',['outerSize',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'Eigen::DenseBase::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'DenseBase< ArrayWrapper< ExpressionType > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'DenseBase< Solve< Decomposition, RhsType > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a3d6ede19db6d42074ae063bc876231b1',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'Eigen::SparseMatrix::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar, ColMajor, int >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'Eigen::SparseMatrixBase::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< Transpose< MatrixType > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::outerSize()']]], - ['outerstride_159',['outerStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#ad88c60c4a2356be2c436f3264dd20b55',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::outerStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#abb333f6f10467f6f8d7b59c213dea49e',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::outerStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#afe47788156e483b9025ab320cc7f925e',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::outerStride()']]], - ['outlierrejector_160',['outlierRejector',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a1c7ec46d4913af1d422b6accb67ddfed',1,'cv::videostab::KeypointBasedMotionEstimator']]], - ['outline_161',['OutLine',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a436e4b941c3da68fae821ed5786620b3',1,'cv::gapi::fluid::Buffer']]], - ['outlineb_162',['OutLineB',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a875c6cfa0315fbb9e1aa94153d7af378',1,'cv::gapi::fluid::Buffer']]], - ['outmatr_163',['outMatR',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#a271dfd3a4a49c4900165991414fc5342',1,'cv::GCPUContext::outMatR()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#ab6561a2ea00141e38ac8afa1f89458ab',1,'cv::GOCLContext::outMatR()']]], - ['outmetas_164',['outMetas',['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#adb1e2c45cc469afe7aa98d5500aac1a4',1,'cv::GCompiled::outMetas()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ac9961bb29f6e049fcda55384877b8bb5',1,'cv::GStreamingCompiled::outMetas()']]], - ['output_165',['Output',['../classfilters_1_1Output.html#a48acc7be07c07f2336679a1d81a1f0e4',1,'filters::Output']]], - ['outputfuncjacobianv_166',['outputFuncJacobianV',['../classfilters_1_1Output.html#ad993de846ff252efb8bb22c99805b508',1,'filters::Output']]], - ['outputfuncjacobianx_167',['outputFuncJacobianX',['../classfilters_1_1Output.html#a5c42af319c18c623e92f92a70b3d0580',1,'filters::Output']]], - ['outputnametoindex_168',['outputNameToIndex',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a60ffc8238f3fa26cd3f49daa7ac0884b',1,'cv::dnn::Layer::outputNameToIndex()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a275295575f6b1a7b5c68d414bf7530aa',1,'cv::dnn::LSTMLayer::outputNameToIndex()']]], - ['outtensor_169',['outTensor',['https://docs.opencv.org/4.2.0/de/d5f/structcv_1_1GPlaidMLContext.html#a1e1172f28b455bf4ed59e22c836e35f2',1,'cv::GPlaidMLContext']]], - ['outvalr_170',['outValR',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#a85b0ee69ff748139aabb7f94c62cc6f3',1,'cv::GCPUContext::outValR()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#ad61c8d7c7df84b5efef5db7527560cb4',1,'cv::GOCLContext::outValR()']]], - ['outvecr_171',['outVecR',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#ac63c2703e6f4e7ae1c6cf77607a4ef31',1,'cv::GCPUContext::outVecR()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a23b6577922d9c1b5b3bb835c16e76afa',1,'cv::GOCLContext::outVecR()']]], - ['outvecref_172',['outVecRef',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#aae9072800907251490f88444df8f8558',1,'cv::GCPUContext::outVecRef()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a0f5085f10ef2311591f023eedd0a0a49',1,'cv::GOCLContext::outVecRef()']]], - ['overflow_173',['overflow',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'__gnu_cxx::enc_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'__gnu_cxx::stdio_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'__gnu_cxx::stdio_sync_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_filebuf< char_type, traits_type >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_streambuf< _Elem, _Tr >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_streambuf< char, _Traits >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_streambuf< char, char_traits< char > >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::basic_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::basic_streambuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::basic_stringbuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::wbuffer_convert::overflow()']]], - ['overlap_174',['overlap',['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#a6a56a625fb5fb0df7c63c69ce7713360',1,'cv::KeyPoint']]], - ['overlaproi_175',['overlapRoi',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gaf9ff38a39051369119b53529b3d779ab',1,'cv::detail::overlapRoi()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gaf9ff38a39051369119b53529b3d779ab',1,'overlapRoi()(Global Namespace)']]] + ['operator_20uchar_80',['operator uchar',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a8b1a6322d1cac24cd929aecad1041f22',1,'cv::RNG']]], + ['operator_20unsigned_81',['operator unsigned',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a8419e63b25666f77d2d388aaae8122ba',1,'cv::RNG::operator unsigned()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a31e2bc86ef08ccb268a10101ee0ccbbf',1,'cv::RNG_MT19937::operator unsigned()']]], + ['operator_20ushort_82',['operator ushort',['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a51e4c416b3ace4840774cceaedcc4b9a',1,'cv::RNG']]], + ['operator_20value_5ft_83',['operator value_t',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a6d4b8df10ecc533a50823e8805f4a873.html#a6d4b8df10ecc533a50823e8805f4a873',1,'nlohmann::basic_json']]], + ['operator_20valuetype_84',['operator ValueType',['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ada1463d8d7ba77865f28f5e83dec7f33.html#ada1463d8d7ba77865f28f5e83dec7f33',1,'nlohmann::basic_json']]], + ['operator_20vec3b_85',['operator Vec3b',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#af5807af9aefd3b74c7feab6544828bec',1,'cv::viz::Color']]], + ['operator_20vec_3c_20_5ftp_2c_202_20_3e_86',['operator Vec< _Tp, 2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a625700af6b447b0803907dc6d845a6b4',1,'cv::Point_']]], + ['operator_20vec_3c_20_5ftp_2c_203_20_3e_87',['operator Vec< _Tp, 3 >',['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a13bc76b8cadfd7a7bc903fd8a8be6167',1,'cv::Point3_']]], + ['operator_20vec_3c_20_5ftp_2c_20n_20_3e_88',['operator Vec< _Tp, n >',['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ae4766cf75071f4e4db698c4120abe57b',1,'cv::Mat']]], + ['operator_20vec_3c_20double_2c_202_20_3e_89',['operator Vec< double, 2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a625700af6b447b0803907dc6d845a6b4',1,'Point_< double >']]], + ['operator_20vec_3c_20float_2c_202_20_3e_90',['operator Vec< float, 2 >',['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#a625700af6b447b0803907dc6d845a6b4',1,'Point_< float >']]], + ['operator_20vec_3c_20t2_2c_20cn_20_3e_91',['operator Vec< T2, cn >',['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'cv::Vec::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< _Tp, 4 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, 2 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, 3 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, 4 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< double, nFeatures >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< float, 2 >::operator Vec< T2, cn >()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a40cd44ce1abcfc65ffb1a0615f0ca493',1,'Vec< float, 3 >::operator Vec< T2, cn >()']]], + ['operator_20vec_3c_20typename_20datatype_3c_20_5ftp_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_92',['operator Vec< typename DataType< _Tp >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'cv::Mat_']]], + ['operator_20vec_3c_20typename_20datatype_3c_20double_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_93',['operator Vec< typename DataType< double >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< double >']]], + ['operator_20vec_3c_20typename_20datatype_3c_20float_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_94',['operator Vec< typename DataType< float >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< float >']]], + ['operator_20vec_3c_20typename_20datatype_3c_20uchar_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_95',['operator Vec< typename DataType< uchar >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< uchar >']]], + ['operator_20vec_3c_20typename_20datatype_3c_20unsigned_20char_20_3e_3a_3achannel_5ftype_2c_20n_20_3e_96',['operator Vec< typename DataType< unsigned char >::channel_type, n >',['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a226466c1e4f426dd00fe5c7b40631e1f',1,'Mat_< unsigned char >']]], + ['operator_21_97',['operator!',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ios< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ios< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_iostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_iostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_istream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'basic_ostream< char, _Traits >::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_fstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_fstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ifstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ifstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ios::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ios::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_iostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_iostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_istringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ofstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ofstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_ostringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_stringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02447.html#a5156257b243c3bcbce9b33147df0eb91',1,'std::basic_stringstream::operator!() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8ae9cabed8e455713324dacd39bedef1',1,'std::valarray::operator!()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8ae9cabed8e455713324dacd39bedef1',1,'valarray< size_t >::operator!()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedd36c90ccd8d1c8ea0d9d121764687e',1,'cv::cudev::operator!(const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a99111955fe2272dece21813539289',1,'cv::cudev::operator!(const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691ce9b6cae1134cdbf39a5ac37ffbc6',1,'cv::cudev::operator!(const Expr< Body > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad387b8de401308ad8764356a902294d4',1,'cv::cudev::operator!(const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga096854f6b69712bd3a6b08b240b390d8',1,'cv::cudev::operator!(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4d6a028a6b6192bf17c25ca75d7f84',1,'cv::cudev::operator!(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2bc16d5e23552ba6fd31b1912fa4a6f',1,'cv::cudev::operator!(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2f274425168b4133ef5270b0ddae7ae',1,'cv::cudev::operator!(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd37e74306bce3962b9b081db9c6064a',1,'cv::cudev::operator!(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38aa67c0f1b4dc9ebe976cdbb2c45771',1,'cv::cudev::operator!(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a32684d4325c9ac27aa698b23ee0ab',1,'cv::cudev::operator!(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6a772b81ca9afc60e6d06f37443b48f',1,'cv::cudev::operator!(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15b5f3146f6815ccfaa75b313cf1bece',1,'cv::cudev::operator!(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa86526fb4e3341ae51d619b0db2cd379',1,'cv::cudev::operator!(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadca17a33d6f1d4b7c85834a156859940',1,'cv::cudev::operator!(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5072fb2fd15a0e93d7cda0cd295bc894',1,'cv::cudev::operator!(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1938b6ba569496387172de1db0a90a9',1,'cv::cudev::operator!(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga710384a11224d911dc1c06966407b070',1,'cv::cudev::operator!(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4575777615eafb52b138f3f70332fcad',1,'cv::cudev::operator!(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66daea7b4632dffed59485b06e850135',1,'cv::cudev::operator!(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41d458a2f3eb470ef98348bc8dcaeec7',1,'cv::cudev::operator!(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga285b3d30ef7b1b1dcf391e62f0a7ab84',1,'cv::cudev::operator!(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ad51bb71a9827aba1389f15aecaf666',1,'cv::cudev::operator!(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48732936efbae4811ff6bd0a5fa6e018',1,'cv::cudev::operator!(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef97c1bdfbf913fbcb909c9014bf2bd0',1,'cv::cudev::operator!(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a5369d6b2d681d7d61226ab28986a19',1,'cv::cudev::operator!(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55a6f14fd6c882ece5bbbeb8633c9191',1,'cv::cudev::operator!(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfd535749b1c35f92e47e69cab7d08af',1,'cv::cudev::operator!(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b788e3270d0fc245b0566f01415334f',1,'cv::cudev::operator!(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9faa344cc89c3f9896d763e4fa9bb9a4',1,'cv::cudev::operator!(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafef7c2b87b9ce254712c0628519895a5',1,'cv::cudev::operator!(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5414c9eaf8734e95201f4485b744d3b2',1,'cv::cudev::operator!(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0314d3c8d73359a7ce7e39c43ed67568',1,'cv::cudev::operator!(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4d8cc9fe8152f04f27ef3f65eb37db1',1,'cv::cudev::operator!(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d66ce3b8d478e84d239d1f28fcf1cf',1,'cv::cudev::operator!(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca58de1b50f1b0f27f31afa3c1a0082e',1,'cv::cudev::operator!(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedd36c90ccd8d1c8ea0d9d121764687e',1,'operator!(const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0a99111955fe2272dece21813539289',1,'operator!(const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691ce9b6cae1134cdbf39a5ac37ffbc6',1,'operator!(const Expr< Body > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad387b8de401308ad8764356a902294d4',1,'operator!(const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga096854f6b69712bd3a6b08b240b390d8',1,'operator!(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4d6a028a6b6192bf17c25ca75d7f84',1,'operator!(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2bc16d5e23552ba6fd31b1912fa4a6f',1,'operator!(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2f274425168b4133ef5270b0ddae7ae',1,'operator!(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd37e74306bce3962b9b081db9c6064a',1,'operator!(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38aa67c0f1b4dc9ebe976cdbb2c45771',1,'operator!(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a32684d4325c9ac27aa698b23ee0ab',1,'operator!(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf6a772b81ca9afc60e6d06f37443b48f',1,'operator!(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15b5f3146f6815ccfaa75b313cf1bece',1,'operator!(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa86526fb4e3341ae51d619b0db2cd379',1,'operator!(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadca17a33d6f1d4b7c85834a156859940',1,'operator!(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5072fb2fd15a0e93d7cda0cd295bc894',1,'operator!(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1938b6ba569496387172de1db0a90a9',1,'operator!(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga710384a11224d911dc1c06966407b070',1,'operator!(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4575777615eafb52b138f3f70332fcad',1,'operator!(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66daea7b4632dffed59485b06e850135',1,'operator!(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41d458a2f3eb470ef98348bc8dcaeec7',1,'operator!(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga285b3d30ef7b1b1dcf391e62f0a7ab84',1,'operator!(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ad51bb71a9827aba1389f15aecaf666',1,'operator!(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48732936efbae4811ff6bd0a5fa6e018',1,'operator!(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef97c1bdfbf913fbcb909c9014bf2bd0',1,'operator!(const uint1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a5369d6b2d681d7d61226ab28986a19',1,'operator!(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55a6f14fd6c882ece5bbbeb8633c9191',1,'operator!(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfd535749b1c35f92e47e69cab7d08af',1,'operator!(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b788e3270d0fc245b0566f01415334f',1,'operator!(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9faa344cc89c3f9896d763e4fa9bb9a4',1,'operator!(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafef7c2b87b9ce254712c0628519895a5',1,'operator!(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5414c9eaf8734e95201f4485b744d3b2',1,'operator!(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0314d3c8d73359a7ce7e39c43ed67568',1,'operator!(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4d8cc9fe8152f04f27ef3f65eb37db1',1,'operator!(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d66ce3b8d478e84d239d1f28fcf1cf',1,'operator!(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca58de1b50f1b0f27f31afa3c1a0082e',1,'operator!(const double4 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8ae9cabed8e455713324dacd39bedef1',1,'operator!() const(Global Namespace)']]], + ['operator_21_3d_98',['operator!=',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a224780d14e4f8aae3e6127d605736bd1',1,'cv::FileNodeIterator::operator!=(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a224780d14e4f8aae3e6127d605736bd1',1,'cv::FileNodeIterator::operator!=(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a6b16d9a0f3bb63fa355a63a05a5fd397',1,'cv::GMatDesc::operator!=()'],['https://docs.opencv.org/4.2.0/d1/d6a/structcv_1_1GScalarDesc.html#a7aa7e15af456abb71d568281f4148781',1,'cv::GScalarDesc::operator!=()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a89ee700214e5c588fc9c2f16dc5f0814',1,'cv::MatExpr::operator!=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0c7b11e74936908ee2fb47e4eb9c5e18',1,'cv::MatExpr::operator!=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a25f71801b3fb6ab5395c2dbcc9cc60ad',1,'cv::MatExpr::operator!=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a76d099d1e862f773c3f0d234b2261feb',1,'cv::MatExpr::operator!=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7105f56350ad1d16b716a3664edbd7f5',1,'cv::MatExpr::operator!=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a89ee700214e5c588fc9c2f16dc5f0814',1,'cv::MatExpr::operator!=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0c7b11e74936908ee2fb47e4eb9c5e18',1,'cv::MatExpr::operator!=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a25f71801b3fb6ab5395c2dbcc9cc60ad',1,'cv::MatExpr::operator!=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a76d099d1e862f773c3f0d234b2261feb',1,'cv::MatExpr::operator!=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7105f56350ad1d16b716a3664edbd7f5',1,'cv::MatExpr::operator!=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#af0917c4e9713001260d67db171256a93',1,'cv::MatSize::operator!=()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'cv::Matx::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'cv::Matx::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< _Tp, cn, 1 >::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< _Tp, cn, 1 >::operator!=(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 1, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 1, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 2 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 2 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 2, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 3 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 3, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 4, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, 4, 4 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, cn, 1 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< double, cn, 1 >::operator!=(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 2, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 2, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 3, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, 3, 3 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, cn, 1 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float, cn, 1 >::operator!=(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float_type, 4, 4 >::operator!=(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a6d1f52fa09b2b5e2c440363a74cd156b',1,'Matx< float_type, 4, 4 >::operator!=(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3e6d2ce9ae1fc533c68737efecdd1b5b',1,'cv::softdouble::operator!=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafa7691dc904caca8588ea6a4b0954e08',1,'cv::softfloat::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#af00d0999bd1cb1c6a731bf5327caea72',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#af00d0999bd1cb1c6a731bf5327caea72',1,'__gnu_pbds::detail::bin_search_tree_node_it_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#ade2fe116ea5d8252d04e3205d8a097f5',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator!=(const binary_heap_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#ac2a94a28e8beb3b3b2e66632636930f9',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator!=(const binary_heap_point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#ac2a94a28e8beb3b3b2e66632636930f9',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#aa943274d090a3ccb2e74e2937ac00e13',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator!=(const left_child_next_sibling_heap_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#ad5876d650788d02f01035cdb3040dd88',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator!=(const left_child_next_sibling_heap_node_point_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#ad5876d650788d02f01035cdb3040dd88',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a210f5b96aa65b4a025d3f4998378862f',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a210f5b96aa65b4a025d3f4998378862f',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a40cf56640357123e880f39e36454b552',1,'const_iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5b0ebe0ad2f13fb20de8c5cff2855216',1,'const_iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a40cf56640357123e880f39e36454b552',1,'iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5b0ebe0ad2f13fb20de8c5cff2855216',1,'iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a40cf56640357123e880f39e36454b552',1,'point_const_iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a5b0ebe0ad2f13fb20de8c5cff2855216',1,'point_const_iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#ae8c663552f5380496391513e71799847',1,'point_iterator_::operator!=(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a0b828d52a1d27c8e786c7171a65bff97',1,'point_iterator_::operator!=(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa69e1223ce6dc3f69fd44cc331bb170e',1,'std::bitset::operator!=(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa69e1223ce6dc3f69fd44cc331bb170e',1,'std::bitset::operator!=(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#adbf547d835746748a205bb57fd81a43f',1,'std::locale::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a2ec683d37e64edce2bea9366a5415677',1,'std::regex_iterator::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a6446149296f14aee3eef4ac516a96f52',1,'std::regex_token_iterator::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a028c7ac8094d610042fd0f9feca68f63',1,'Eigen::MatrixBase::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a028c7ac8094d610042fd0f9feca68f63',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a028c7ac8094d610042fd0f9feca68f63',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'Eigen::QuaternionBase::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator!=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a530edf22f03853cd07ba829ea0d505dc',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator!=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_a760bf39cc5477bc663d8bb3c44aabf6a.html#a760bf39cc5477bc663d8bb3c44aabf6a',1,'nlohmann::byte_container_with_subtype::operator!=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacfed05378c432f84c46e3a2e80e321e8',1,'cv::operator!=()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8292fe7dc983ee976f9f112bcb9b6c1d',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7d957663c54fb266f22662e02d515a0',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga134eff23af476bb078268d470c5a1eab',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30827c997d70e1ec669dfe661188bf97',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a85ae32eae025d733fb5e3ef556bf1a',1,'cv::cudev::operator!=(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b6fc14c39892e90df1b408a88f4a89',1,'cv::cudev::operator!=(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae195999272c703fd97df7a3b66e061c1',1,'cv::cudev::operator!=(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a70181a870d6be3b2045a194b2ba0a3',1,'cv::cudev::operator!=(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0433dbcd94c2e678a7c1938c24ee08da',1,'cv::cudev::operator!=(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26dbfbf9dc0e5fc90b82f41229c84899',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1efe076c9144b56c61e17b96fa6e210e',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e37d9a1418a94d91adf91c477519144',1,'cv::cudev::operator!=(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa35d062549d2cfa7d9841e1ac7799a44',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f22949e60450f64d1b3c459de0e7a27',1,'cv::cudev::operator!=(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71df1ef74ebec36966335c1b5449a07b',1,'cv::cudev::operator!=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51b3e383f16f20dc1928d89f4524bce',1,'cv::cudev::operator!=(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a34b56e3225c861848f01b4e3b1c44a',1,'cv::cudev::operator!=(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61134a26d4c0e5ca4467638109358eaa',1,'cv::cudev::operator!=(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac01068a2f43c82f8e14d0ac68996c903',1,'cv::cudev::operator!=(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00b76efa5a61126d47883ddbf36799f0',1,'cv::cudev::operator!=(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1a88913cdea995341a95e23135b06bf',1,'cv::cudev::operator!=(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa295a03a44435b12c5b2ce66bf4c1d8d',1,'cv::cudev::operator!=(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba8ae9e88782d3b46baa0cd308b594ca',1,'cv::cudev::operator!=(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc15d3d94c1bf3032fa82162cd5d08c2',1,'cv::cudev::operator!=(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bbfb03a53e5581effe1f9f98d30873',1,'cv::cudev::operator!=(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35e7a1277bb5d5249c578b0a289f4a5b',1,'cv::cudev::operator!=(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2cfd0dba2d83f0dd7e267fb537c6df3',1,'cv::cudev::operator!=(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga904fe1a365ccf3f52ded833f98ab4c1d',1,'cv::cudev::operator!=(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27dfb14836d9f082e79d9a804291564',1,'cv::cudev::operator!=(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c715a1f404a93f452cd718cd61822ef',1,'cv::cudev::operator!=(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1196cca16594f3ca574ffae1e94e7b1',1,'cv::cudev::operator!=(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2540630d91b7767930621ce3c6fd76e1',1,'cv::cudev::operator!=(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb08af5c7f389e522b5822a4ed2f9461',1,'cv::cudev::operator!=(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23c79a1928e13afc502bb8b7f331e430',1,'cv::cudev::operator!=(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc40e9339bd3ac67fd8cbd5b027e18d',1,'cv::cudev::operator!=(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f3ae663608af22f0c147d4d1c0cec9b',1,'cv::cudev::operator!=(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4dfd8489e7ec481cbe03b56039599e',1,'cv::cudev::operator!=(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae80f5e0d14e29c9a5505deee930a41d7',1,'cv::cudev::operator!=(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad791250abb63d31f2fd906d838f3994a',1,'cv::cudev::operator!=(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ce12579d99d81239384b64b528d9e67',1,'cv::cudev::operator!=(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ddfdc36315c9e7eae56b412d83b0a05',1,'cv::cudev::operator!=(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga781786668348ca67ef6fc9f333fd76bd',1,'cv::cudev::operator!=(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32d5f8d24bdce45881f83215c243ed9d',1,'cv::cudev::operator!=(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ba755d444526c74046317135fdc2f06',1,'cv::cudev::operator!=(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga018afdf83525378f4fb0e87057ddd12c',1,'cv::cudev::operator!=(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fbf5e5e077bbe431d43e5dfc3199595',1,'cv::cudev::operator!=(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a74d8b5cff07e001fa59b0bdf4bdc8',1,'cv::cudev::operator!=(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7e2f8cdd7843ea8e78f8c1e4c69df0b',1,'cv::cudev::operator!=(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d3a7254a567bbb65a400e55dd85ff93',1,'cv::cudev::operator!=(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0e2aaffe5179188a45b52ed7d05b665',1,'cv::cudev::operator!=(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa416b9a794190e20a62b08cde74fa95c',1,'cv::cudev::operator!=(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06e89f04ab74961a37ba14c5e2f84832',1,'cv::cudev::operator!=(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga059791beca5a629072a39a00978f4a7f',1,'cv::cudev::operator!=(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d61cb0c52994efdf53d7c912582bf8b',1,'cv::cudev::operator!=(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7bcfb20794a46293a7d4e7301b44f7',1,'cv::cudev::operator!=(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02ef404a904a3ec832c9add12935eacc',1,'cv::cudev::operator!=(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14e0dc7340bf0380c8e7ff3b6ad61d8d',1,'cv::cudev::operator!=(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35c3b84bb03b81839a2c3e9c1055a80f',1,'cv::cudev::operator!=(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7f1eaafa2eba2a41778d32070a3a2a',1,'cv::cudev::operator!=(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba5e0f75bf2cc2fd562e3df677ea694',1,'cv::cudev::operator!=(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae703f571d189f59c10ac1b776fb51404',1,'cv::cudev::operator!=(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a865177e087ade5119108ad893fc40',1,'cv::cudev::operator!=(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f332aaeee915649e3ba300bfd6e0862',1,'cv::cudev::operator!=(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f549d8efea1133b101ffce070bf7bb1',1,'cv::cudev::operator!=(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3dc461d11161c9c0269d007f9c0664',1,'cv::cudev::operator!=(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301514bbd97b257d879b7b956231618d',1,'cv::cudev::operator!=(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f6246f3563a2788bdab0ffd43946a28',1,'cv::cudev::operator!=(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27c5affcafc4dfbaa5bd97878a85805',1,'cv::cudev::operator!=(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0cda31d15dbbaad26ee24e31deaeb0',1,'cv::cudev::operator!=(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab81a1eee4dcf637837acd349d99bc9',1,'cv::cudev::operator!=(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeac8a5773046490bb3e174f794f9a3bf',1,'cv::cudev::operator!=(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbb8eef6cbff069ea514a1d08d1c1acc',1,'cv::cudev::operator!=(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c79714df94e4874571a6f6fbe802261',1,'cv::cudev::operator!=(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92977e9cd4b8299c7b4193be69e38140',1,'cv::cudev::operator!=(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade3a83bdc7ef86bfdbf599502d46baca',1,'cv::cudev::operator!=(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga770fa7102571a71eecff41db456a32a0',1,'cv::cudev::operator!=(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16f17453bfe07cca9818f9e8b3934955',1,'cv::cudev::operator!=(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37bc7a2403de26ee46a764916836e73',1,'cv::cudev::operator!=(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafaf36c9bcfe7c72a427dfaac657e291d',1,'cv::cudev::operator!=(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadad41dbc0aece9daa78fcf41a69673de',1,'cv::cudev::operator!=(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cb807429ac3b09197050a95728f556a',1,'cv::cudev::operator!=(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba1495d7b1d080f397329f02159c01e',1,'cv::cudev::operator!=(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9baa29316abd1f38a665c6cbc8cacab7',1,'cv::cudev::operator!=(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7603a241df59c649cc55105a1628df',1,'cv::cudev::operator!=(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195211f7ce1c4f3d67db531c2831f724',1,'cv::cudev::operator!=(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41419f07a921918f0701c998a8d76fb',1,'cv::cudev::operator!=(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae089ee9fd05ad99eebf886d55bfe7152',1,'cv::cudev::operator!=(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5dbacd27f428cce7bc009baf93a731f8',1,'cv::cudev::operator!=(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ca3d062d928c0f22cac521b71d9531a',1,'cv::cudev::operator!=(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e9806f1e89dded32d75e063645de53',1,'cv::cudev::operator!=(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e5d5b6b33702c5f4049358633041d36',1,'cv::cudev::operator!=(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga831de1ee68dbe4cabe2785d3b4ee4823',1,'cv::cudev::operator!=(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae125433024aa211123e58c04f034c750',1,'cv::cudev::operator!=(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c10e74e42a3199d23aacd569ecbdf3f',1,'cv::cudev::operator!=(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99fea0f04ddb67c943effb33762e48d',1,'cv::cudev::operator!=(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f4f66d6868e12eaccee9521e2751810',1,'cv::cudev::operator!=(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga358969872ca6b79e0c141bd4682085df',1,'cv::cudev::operator!=(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga300d7581d3c1bc8213d2690878045735',1,'cv::cudev::operator!=(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25c43cc94bc4759b75116adfe773f496',1,'cv::cudev::operator!=(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51077c5df4c6a888b84142e1af07b23',1,'cv::cudev::operator!=(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb9347618d1909b4307d5f5e8d5e0ec1',1,'cv::cudev::operator!=(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70e9295c70897f7ee8f165b2b9b92006',1,'cv::cudev::operator!=(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7816e638f08658a7127889f8924d463a',1,'cv::cudev::operator!=(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec66007c1a31dcf3aa21addda8d2e057',1,'cv::cudev::operator!=(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5df23018756bf58482b48b72f91c69',1,'cv::cudev::operator!=(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9f59dd31ae3f09e713717a052fb2d41',1,'cv::cudev::operator!=(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2edb4f9db0181f0ed159c100272de19e',1,'cv::cudev::operator!=(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14cc69402191ad1a9fadafc1797e4e5',1,'cv::cudev::operator!=(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefc9c61d220f8a87a7c07e07a1de92ef',1,'cv::cudev::operator!=(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c1259a165b16ae5e1a2e7582dc6ca19',1,'cv::cudev::operator!=(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27400033a8ccdaf73828d9569ab1d11f',1,'cv::cudev::operator!=(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64ebcee14a400f7d929e78336d556f76',1,'cv::cudev::operator!=(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c2fc1b7beb65f98f4f60313e89892',1,'cv::cudev::operator!=(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd4ea537ef260913359d331676ee41',1,'cv::cudev::operator!=(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d16922ec836552a427512b69378cea5',1,'cv::cudev::operator!=(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23335c5da9c49fc7fad795f8151ed17e',1,'cv::cudev::operator!=(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e6ecff1ed67f5619c81d15d6c61d2aa',1,'cv::cudev::operator!=(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d04608dbf78c558bbc9fe3157c1fa03',1,'cv::cudev::operator!=(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2b7ac6b676b027054f92659fcbd62b3',1,'cv::cudev::operator!=(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1074c3499e6d2197ec635fb11e013f59',1,'cv::cudev::operator!=(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d4/d1c/namespacecv_1_1gapi.html#ad56f6fcb23f2a9cfb755740235424a11',1,'cv::gapi::operator!=()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a1fd873abaeb604fdbf9e008118552f6e',1,'cv::gapi::own::operator!=(const Rect &lhs, const Rect &rhs)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a9afb185df936f93b5388f549a463e618',1,'cv::gapi::own::operator!=(const Size &lhs, const Size &rhs)'],['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#a026ad4480a333be3a691a7c7311da00b',1,'cv::tbm::operator!=()'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#aefce3a0692acbbc03674218a59ded1bc',1,'cv::util::operator!=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gafa7691dc904caca8588ea6a4b0954e08',1,'operator!=(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3e6d2ce9ae1fc533c68737efecdd1b5b',1,'operator!=(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacfed05378c432f84c46e3a2e80e321e8',1,'operator!=(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8292fe7dc983ee976f9f112bcb9b6c1d',1,'operator!=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7d957663c54fb266f22662e02d515a0',1,'operator!=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga134eff23af476bb078268d470c5a1eab',1,'operator!=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30827c997d70e1ec669dfe661188bf97',1,'operator!=(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a85ae32eae025d733fb5e3ef556bf1a',1,'operator!=(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b6fc14c39892e90df1b408a88f4a89',1,'operator!=(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae195999272c703fd97df7a3b66e061c1',1,'operator!=(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a70181a870d6be3b2045a194b2ba0a3',1,'operator!=(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0433dbcd94c2e678a7c1938c24ee08da',1,'operator!=(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26dbfbf9dc0e5fc90b82f41229c84899',1,'operator!=(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1efe076c9144b56c61e17b96fa6e210e',1,'operator!=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e37d9a1418a94d91adf91c477519144',1,'operator!=(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa35d062549d2cfa7d9841e1ac7799a44',1,'operator!=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f22949e60450f64d1b3c459de0e7a27',1,'operator!=(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71df1ef74ebec36966335c1b5449a07b',1,'operator!=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51b3e383f16f20dc1928d89f4524bce',1,'operator!=(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a34b56e3225c861848f01b4e3b1c44a',1,'operator!=(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61134a26d4c0e5ca4467638109358eaa',1,'operator!=(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac01068a2f43c82f8e14d0ac68996c903',1,'operator!=(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00b76efa5a61126d47883ddbf36799f0',1,'operator!=(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1a88913cdea995341a95e23135b06bf',1,'operator!=(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa295a03a44435b12c5b2ce66bf4c1d8d',1,'operator!=(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba8ae9e88782d3b46baa0cd308b594ca',1,'operator!=(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc15d3d94c1bf3032fa82162cd5d08c2',1,'operator!=(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94bbfb03a53e5581effe1f9f98d30873',1,'operator!=(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35e7a1277bb5d5249c578b0a289f4a5b',1,'operator!=(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2cfd0dba2d83f0dd7e267fb537c6df3',1,'operator!=(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga904fe1a365ccf3f52ded833f98ab4c1d',1,'operator!=(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27dfb14836d9f082e79d9a804291564',1,'operator!=(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c715a1f404a93f452cd718cd61822ef',1,'operator!=(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1196cca16594f3ca574ffae1e94e7b1',1,'operator!=(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2540630d91b7767930621ce3c6fd76e1',1,'operator!=(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb08af5c7f389e522b5822a4ed2f9461',1,'operator!=(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23c79a1928e13afc502bb8b7f331e430',1,'operator!=(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc40e9339bd3ac67fd8cbd5b027e18d',1,'operator!=(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f3ae663608af22f0c147d4d1c0cec9b',1,'operator!=(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff4dfd8489e7ec481cbe03b56039599e',1,'operator!=(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae80f5e0d14e29c9a5505deee930a41d7',1,'operator!=(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad791250abb63d31f2fd906d838f3994a',1,'operator!=(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ce12579d99d81239384b64b528d9e67',1,'operator!=(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ddfdc36315c9e7eae56b412d83b0a05',1,'operator!=(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga781786668348ca67ef6fc9f333fd76bd',1,'operator!=(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32d5f8d24bdce45881f83215c243ed9d',1,'operator!=(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ba755d444526c74046317135fdc2f06',1,'operator!=(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga018afdf83525378f4fb0e87057ddd12c',1,'operator!=(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fbf5e5e077bbe431d43e5dfc3199595',1,'operator!=(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03a74d8b5cff07e001fa59b0bdf4bdc8',1,'operator!=(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7e2f8cdd7843ea8e78f8c1e4c69df0b',1,'operator!=(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d3a7254a567bbb65a400e55dd85ff93',1,'operator!=(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0e2aaffe5179188a45b52ed7d05b665',1,'operator!=(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa416b9a794190e20a62b08cde74fa95c',1,'operator!=(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06e89f04ab74961a37ba14c5e2f84832',1,'operator!=(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga059791beca5a629072a39a00978f4a7f',1,'operator!=(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d61cb0c52994efdf53d7c912582bf8b',1,'operator!=(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa7bcfb20794a46293a7d4e7301b44f7',1,'operator!=(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02ef404a904a3ec832c9add12935eacc',1,'operator!=(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14e0dc7340bf0380c8e7ff3b6ad61d8d',1,'operator!=(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35c3b84bb03b81839a2c3e9c1055a80f',1,'operator!=(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7f1eaafa2eba2a41778d32070a3a2a',1,'operator!=(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba5e0f75bf2cc2fd562e3df677ea694',1,'operator!=(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae703f571d189f59c10ac1b776fb51404',1,'operator!=(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a865177e087ade5119108ad893fc40',1,'operator!=(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f332aaeee915649e3ba300bfd6e0862',1,'operator!=(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f549d8efea1133b101ffce070bf7bb1',1,'operator!=(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3dc461d11161c9c0269d007f9c0664',1,'operator!=(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301514bbd97b257d879b7b956231618d',1,'operator!=(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f6246f3563a2788bdab0ffd43946a28',1,'operator!=(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac27c5affcafc4dfbaa5bd97878a85805',1,'operator!=(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea0cda31d15dbbaad26ee24e31deaeb0',1,'operator!=(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab81a1eee4dcf637837acd349d99bc9',1,'operator!=(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeac8a5773046490bb3e174f794f9a3bf',1,'operator!=(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbb8eef6cbff069ea514a1d08d1c1acc',1,'operator!=(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c79714df94e4874571a6f6fbe802261',1,'operator!=(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92977e9cd4b8299c7b4193be69e38140',1,'operator!=(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade3a83bdc7ef86bfdbf599502d46baca',1,'operator!=(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga770fa7102571a71eecff41db456a32a0',1,'operator!=(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16f17453bfe07cca9818f9e8b3934955',1,'operator!=(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37bc7a2403de26ee46a764916836e73',1,'operator!=(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafaf36c9bcfe7c72a427dfaac657e291d',1,'operator!=(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadad41dbc0aece9daa78fcf41a69673de',1,'operator!=(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cb807429ac3b09197050a95728f556a',1,'operator!=(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba1495d7b1d080f397329f02159c01e',1,'operator!=(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9baa29316abd1f38a665c6cbc8cacab7',1,'operator!=(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7603a241df59c649cc55105a1628df',1,'operator!=(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195211f7ce1c4f3d67db531c2831f724',1,'operator!=(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab41419f07a921918f0701c998a8d76fb',1,'operator!=(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae089ee9fd05ad99eebf886d55bfe7152',1,'operator!=(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5dbacd27f428cce7bc009baf93a731f8',1,'operator!=(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ca3d062d928c0f22cac521b71d9531a',1,'operator!=(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e9806f1e89dded32d75e063645de53',1,'operator!=(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e5d5b6b33702c5f4049358633041d36',1,'operator!=(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga831de1ee68dbe4cabe2785d3b4ee4823',1,'operator!=(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae125433024aa211123e58c04f034c750',1,'operator!=(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c10e74e42a3199d23aacd569ecbdf3f',1,'operator!=(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae99fea0f04ddb67c943effb33762e48d',1,'operator!=(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f4f66d6868e12eaccee9521e2751810',1,'operator!=(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga358969872ca6b79e0c141bd4682085df',1,'operator!=(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga300d7581d3c1bc8213d2690878045735',1,'operator!=(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25c43cc94bc4759b75116adfe773f496',1,'operator!=(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae51077c5df4c6a888b84142e1af07b23',1,'operator!=(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb9347618d1909b4307d5f5e8d5e0ec1',1,'operator!=(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70e9295c70897f7ee8f165b2b9b92006',1,'operator!=(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7816e638f08658a7127889f8924d463a',1,'operator!=(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec66007c1a31dcf3aa21addda8d2e057',1,'operator!=(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5df23018756bf58482b48b72f91c69',1,'operator!=(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9f59dd31ae3f09e713717a052fb2d41',1,'operator!=(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2edb4f9db0181f0ed159c100272de19e',1,'operator!=(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14cc69402191ad1a9fadafc1797e4e5',1,'operator!=(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefc9c61d220f8a87a7c07e07a1de92ef',1,'operator!=(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c1259a165b16ae5e1a2e7582dc6ca19',1,'operator!=(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27400033a8ccdaf73828d9569ab1d11f',1,'operator!=(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64ebcee14a400f7d929e78336d556f76',1,'operator!=(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c2fc1b7beb65f98f4f60313e89892',1,'operator!=(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd4ea537ef260913359d331676ee41',1,'operator!=(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d16922ec836552a427512b69378cea5',1,'operator!=(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23335c5da9c49fc7fad795f8151ed17e',1,'operator!=(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e6ecff1ed67f5619c81d15d6c61d2aa',1,'operator!=(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d04608dbf78c558bbc9fe3157c1fa03',1,'operator!=(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2b7ac6b676b027054f92659fcbd62b3',1,'operator!=(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1074c3499e6d2197ec635fb11e013f59',1,'operator!=(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ab051cea08cf039852e3351b93b8c5a81',1,'__gnu_cxx::operator!=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a1181402b4656a1da4bf2e9608aed3c38',1,'__gnu_cxx::operator!=(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a9deee1071e354ea98296b431b4643511',1,'__gnu_cxx::operator!=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga51a6d053b3eb004ee172b8e7ef066854',1,'std::operator!=(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a481ee02f06a7c42bd2762516975d7082',1,'std::operator!=(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a98c391c7d64a5a01cf0d162c4fb959ca',1,'std::operator!=(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#gafb9c9578afd0299fc357581cb848f2fd',1,'std::operator!=(const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__lhs, const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga226dae1d9406b9c3804f20d31c15e21a',1,'std::operator!=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga08598cac266ed03507603ca6d6c27ce2',1,'std::operator!=(const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__lhs, const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a48d985ba8cc72e159372b14b9114da73',1,'std::operator!=(const function< _Res(_Args...)> &__f, nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac0daaa77f5550fd185352175aa05fc89',1,'std::operator!=(nullptr_t, const function< _Res(_Args...)> &__f) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga58cddddd716e5fe8d9ef54732399b68f',1,'std::operator!=(const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__lhs, const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a20729b0ed4cf42aa7dba9c24e71243f0',1,'std::operator!=(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2855896e6ac169748344ed4e2f064ccb',1,'std::operator!=(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e9b319feda06c3f9bbc8c501d7ed5c',1,'std::operator!=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga223f7056b37b325f9d70eda843982dff',1,'std::operator!=(const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__lhs, const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga26b97c6b57337790d75c65c39461d57b',1,'std::operator!=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a376c99e0db4e24c69c2beecd6c11b54e',1,'std::operator!=(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c4c0391a3cd864c981a2752bbb39e87',1,'std::operator!=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c5fbbe825fb3b00793f87d5b0f84b37',1,'std::operator!=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga8ad332f998832aa3bbf426abf441c34a',1,'std::operator!=(const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__lhs, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeffd353ea0720cf2338ac2cd23511b9f',1,'std::operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafd4ac060b48dc528864dcb79b7ac47b9',1,'std::operator!=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae4e62dff9be77e98ba29da34c0eee1b7',1,'std::operator!=(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6b5d199f9e89bfca5738b76671a4118b',1,'std::operator!=(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4a40078467f136b65820875414060d72',1,'std::operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga47c5a5d9835e00a60a76f4be7ea0f671',1,'std::operator!=(const std::shuffle_order_engine< _RandomNumberEngine, __k > &__lhs, const std::shuffle_order_engine< _RandomNumberEngine, __k > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gaca2a091ac2ef5b09deba9d1d185b16ad',1,'std::operator!=(const std::uniform_int_distribution< _IntType > &__d1, const std::uniform_int_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa8e4871fc2d47ad1f14e43949b9ce938',1,'std::operator!=(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gae4180334ebfbfbbae6f1f9901819a52e',1,'std::operator!=(const std::uniform_real_distribution< _IntType > &__d1, const std::uniform_real_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gade5eaebb40897ed5c453b3d1ef9ee18d',1,'std::operator!=(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a44ba4a39615cc57e58325da2c9a2372c',1,'std::operator!=(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga227eec7c437a7d893172e4387a0fb041',1,'std::operator!=(const std::normal_distribution< _RealType > &__d1, const std::normal_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a01fe16a0529fecdacda453c5cb1ce28a',1,'std::operator!=(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga611caefadf0614ec3e3a5bd8a95c11ac',1,'std::operator!=(const std::lognormal_distribution< _RealType > &__d1, const std::lognormal_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gafdf8a737eaa64e171fd0617603e7a6a7',1,'std::operator!=(const std::gamma_distribution< _RealType > &__d1, const std::gamma_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gac4dbdb98454ba9eac4efedb236380fff',1,'std::operator!=(const std::chi_squared_distribution< _RealType > &__d1, const std::chi_squared_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gaf8d44ddbae75bc9aac07aca501130b3a',1,'std::operator!=(const std::cauchy_distribution< _RealType > &__d1, const std::cauchy_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabeee8cc21eaf2d1ac14d819e56e933ee',1,'std::operator!=(const std::fisher_f_distribution< _RealType > &__d1, const std::fisher_f_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga9f65157c0c5e6316e415b7fbf5edbad4',1,'std::operator!=(const std::student_t_distribution< _RealType > &__d1, const std::student_t_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga1b42c0c69b003733630addb17455e78c',1,'std::operator!=(const std::bernoulli_distribution &__d1, const std::bernoulli_distribution &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga03255c2d29292408f9e417d8c19749d5',1,'std::operator!=(const std::binomial_distribution< _IntType > &__d1, const std::binomial_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#gada2797560998107294e60ece46615d73',1,'std::operator!=(const std::geometric_distribution< _IntType > &__d1, const std::geometric_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga0ecd009cd763508bbac68e62a14fa73c',1,'std::operator!=(const std::negative_binomial_distribution< _IntType > &__d1, const std::negative_binomial_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga16e064b3a8822c1a5b84e0b146b2a701',1,'std::operator!=(const std::poisson_distribution< _IntType > &__d1, const std::poisson_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gadb6734dde139796b0c17ab7da2092000',1,'std::operator!=(const std::exponential_distribution< _RealType > &__d1, const std::exponential_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga93a5f8cbd4387728796f825a8004f3fe',1,'std::operator!=(const std::weibull_distribution< _RealType > &__d1, const std::weibull_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga7cb0e95ae2658e8fbce52e9b83969955',1,'std::operator!=(const std::extreme_value_distribution< _RealType > &__d1, const std::extreme_value_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gaf7323b91cdc741135f4099930580987b',1,'std::operator!=(const std::discrete_distribution< _IntType > &__d1, const std::discrete_distribution< _IntType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga1c4c402db457c46e730ba427efda1f5a',1,'std::operator!=(const std::piecewise_constant_distribution< _RealType > &__d1, const std::piecewise_constant_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga34f4ca07d82381cbfd41b4563b5f265e',1,'std::operator!=(const std::piecewise_linear_distribution< _RealType > &__d1, const std::piecewise_linear_distribution< _RealType > &__d2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9551f72d5a20e1b3db6d73876b71be9c',1,'std::operator!=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad109463a06be6ce8e32bd270cc92e7c8',1,'std::operator!=(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5cc85385236f8a6157f148fcf2505196',1,'std::operator!=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga73a0309c22f804987d01e41c3af8d953',1,'std::operator!=(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga4f04509aa5b848bb961d6c4898fc8ee6',1,'std::operator!=(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga05e38fe09ca2ceb867e8cbaf0df2d43b',1,'std::operator!=(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#a90a8bcb2378458899b902c6eb8834bd2',1,'std::rel_ops::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga2b4bf8c35aa9cd820d1bc042accb8687',1,'std::tr2::operator!=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga1b42c0c69b003733630addb17455e78c',1,'operator!=(const std::bernoulli_distribution &__d1, const std::bernoulli_distribution &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga03255c2d29292408f9e417d8c19749d5',1,'operator!=(const std::binomial_distribution< _IntType > &__d1, const std::binomial_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#gada2797560998107294e60ece46615d73',1,'operator!=(const std::geometric_distribution< _IntType > &__d1, const std::geometric_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga0ecd009cd763508bbac68e62a14fa73c',1,'operator!=(const std::negative_binomial_distribution< _IntType > &__d1, const std::negative_binomial_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga73a0309c22f804987d01e41c3af8d953',1,'operator!=(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga4f04509aa5b848bb961d6c4898fc8ee6',1,'operator!=(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga05e38fe09ca2ceb867e8cbaf0df2d43b',1,'operator!=(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga2b4bf8c35aa9cd820d1bc042accb8687',1,'operator!=(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga51a6d053b3eb004ee172b8e7ef066854',1,'operator!=(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga227eec7c437a7d893172e4387a0fb041',1,'operator!=(const std::normal_distribution< _RealType > &__d1, const std::normal_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga611caefadf0614ec3e3a5bd8a95c11ac',1,'operator!=(const std::lognormal_distribution< _RealType > &__d1, const std::lognormal_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gafdf8a737eaa64e171fd0617603e7a6a7',1,'operator!=(const std::gamma_distribution< _RealType > &__d1, const std::gamma_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gac4dbdb98454ba9eac4efedb236380fff',1,'operator!=(const std::chi_squared_distribution< _RealType > &__d1, const std::chi_squared_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gaf8d44ddbae75bc9aac07aca501130b3a',1,'operator!=(const std::cauchy_distribution< _RealType > &__d1, const std::cauchy_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabeee8cc21eaf2d1ac14d819e56e933ee',1,'operator!=(const std::fisher_f_distribution< _RealType > &__d1, const std::fisher_f_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga9f65157c0c5e6316e415b7fbf5edbad4',1,'operator!=(const std::student_t_distribution< _RealType > &__d1, const std::student_t_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga16e064b3a8822c1a5b84e0b146b2a701',1,'operator!=(const std::poisson_distribution< _IntType > &__d1, const std::poisson_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gadb6734dde139796b0c17ab7da2092000',1,'operator!=(const std::exponential_distribution< _RealType > &__d1, const std::exponential_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga93a5f8cbd4387728796f825a8004f3fe',1,'operator!=(const std::weibull_distribution< _RealType > &__d1, const std::weibull_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga7cb0e95ae2658e8fbce52e9b83969955',1,'operator!=(const std::extreme_value_distribution< _RealType > &__d1, const std::extreme_value_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gaf7323b91cdc741135f4099930580987b',1,'operator!=(const std::discrete_distribution< _IntType > &__d1, const std::discrete_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga1c4c402db457c46e730ba427efda1f5a',1,'operator!=(const std::piecewise_constant_distribution< _RealType > &__d1, const std::piecewise_constant_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga34f4ca07d82381cbfd41b4563b5f265e',1,'operator!=(const std::piecewise_linear_distribution< _RealType > &__d1, const std::piecewise_linear_distribution< _RealType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#gafb9c9578afd0299fc357581cb848f2fd',1,'operator!=(const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__lhs, const std::linear_congruential_engine< _UIntType, __a, __c, __m > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga08598cac266ed03507603ca6d6c27ce2',1,'operator!=(const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__lhs, const std::mersenne_twister_engine< _UIntType, __w, __n, __m, __r, __a, __u, __d, __s, __b, __t, __c, __l, __f > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga58cddddd716e5fe8d9ef54732399b68f',1,'operator!=(const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__lhs, const std::subtract_with_carry_engine< _UIntType, __w, __s, __r > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga223f7056b37b325f9d70eda843982dff',1,'operator!=(const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__lhs, const std::discard_block_engine< _RandomNumberEngine, __p, __r > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga8ad332f998832aa3bbf426abf441c34a',1,'operator!=(const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__lhs, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga47c5a5d9835e00a60a76f4be7ea0f671',1,'operator!=(const std::shuffle_order_engine< _RandomNumberEngine, __k > &__lhs, const std::shuffle_order_engine< _RandomNumberEngine, __k > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga82e9b319feda06c3f9bbc8c501d7ed5c',1,'operator!=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga26b97c6b57337790d75c65c39461d57b',1,'operator!=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c4c0391a3cd864c981a2752bbb39e87',1,'operator!=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4c5fbbe825fb3b00793f87d5b0f84b37',1,'operator!=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeffd353ea0720cf2338ac2cd23511b9f',1,'operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafd4ac060b48dc528864dcb79b7ac47b9',1,'operator!=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4a40078467f136b65820875414060d72',1,'operator!=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gade5eaebb40897ed5c453b3d1ef9ee18d',1,'operator!=(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gaca2a091ac2ef5b09deba9d1d185b16ad',1,'operator!=(const std::uniform_int_distribution< _IntType > &__d1, const std::uniform_int_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gae4180334ebfbfbbae6f1f9901819a52e',1,'operator!=(const std::uniform_real_distribution< _IntType > &__d1, const std::uniform_real_distribution< _IntType > &__d2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga226dae1d9406b9c3804f20d31c15e21a',1,'operator!=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], + ['operator_25_99',['operator%',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6ec4cce27f5f5c22c51fd8923d0f11',1,'cv::softdouble::operator%()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga69f4dbc0a0eace2d056676b41ca65ff2',1,'cv::softfloat::operator%()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa37b11432b1ebde054af826f340a2c31',1,'cv::cudev::operator%(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab31dfd9be961e597a6ff20fe16aa442b',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga773b0b2650985c05a19fc3b2cea02157',1,'cv::cudev::operator%(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e04cff3e3f4dc32f4ad6f4ea1a175f1',1,'cv::cudev::operator%(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b8b1d46430656d69ace43bf63ef5a03',1,'cv::cudev::operator%(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9aa960339addec61dae59f72ad661f6',1,'cv::cudev::operator%(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59fd9fd64abbdbf6d02111258ff3ee3a',1,'cv::cudev::operator%(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dcc4a1f5610061e0994d8554cfc765b',1,'cv::cudev::operator%(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6093692666282b857f5c312c9669def',1,'cv::cudev::operator%(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9290539128e5d0844f4480b49b3d7088',1,'cv::cudev::operator%(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9373b5425bc87bbf899c139216f9a60a',1,'cv::cudev::operator%(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82bdb4bd976961e8077c200d91a371e3',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d5639fedbfd3ea5fae538d1ccbb97f4',1,'cv::cudev::operator%(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga761216132a87e3c512b66743403bd25e',1,'cv::cudev::operator%(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4a930fbaafd0bef775d17c39a71fc97',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa27152eb3298e3345232dd01c77c0d',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57c116145cb62d4a4027f9639145aa45',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb82ed401680a151f1d811f79c907687',1,'cv::cudev::operator%(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20f538ce841c4168ea7b676bc4d721ce',1,'cv::cudev::operator%(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea561c006efad0fe66fb54961baf414f',1,'cv::cudev::operator%(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74bf8c1b04c651db7c598cf7064b763',1,'cv::cudev::operator%(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5314568374d8a1d07ca11c4bb88047c',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7714be790d76153dbdc8d751a943bc',1,'cv::cudev::operator%(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d4e175fcb53cd7926bc3787754faf86',1,'cv::cudev::operator%(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga69f4dbc0a0eace2d056676b41ca65ff2',1,'operator%(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6ec4cce27f5f5c22c51fd8923d0f11',1,'operator%(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa37b11432b1ebde054af826f340a2c31',1,'operator%(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab31dfd9be961e597a6ff20fe16aa442b',1,'operator%(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga773b0b2650985c05a19fc3b2cea02157',1,'operator%(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e04cff3e3f4dc32f4ad6f4ea1a175f1',1,'operator%(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b8b1d46430656d69ace43bf63ef5a03',1,'operator%(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9aa960339addec61dae59f72ad661f6',1,'operator%(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59fd9fd64abbdbf6d02111258ff3ee3a',1,'operator%(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dcc4a1f5610061e0994d8554cfc765b',1,'operator%(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6093692666282b857f5c312c9669def',1,'operator%(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9290539128e5d0844f4480b49b3d7088',1,'operator%(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9373b5425bc87bbf899c139216f9a60a',1,'operator%(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82bdb4bd976961e8077c200d91a371e3',1,'operator%(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d5639fedbfd3ea5fae538d1ccbb97f4',1,'operator%(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga761216132a87e3c512b66743403bd25e',1,'operator%(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4a930fbaafd0bef775d17c39a71fc97',1,'operator%(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa27152eb3298e3345232dd01c77c0d',1,'operator%(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57c116145cb62d4a4027f9639145aa45',1,'operator%(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb82ed401680a151f1d811f79c907687',1,'operator%(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20f538ce841c4168ea7b676bc4d721ce',1,'operator%(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea561c006efad0fe66fb54961baf414f',1,'operator%(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf74bf8c1b04c651db7c598cf7064b763',1,'operator%(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5314568374d8a1d07ca11c4bb88047c',1,'operator%(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a7714be790d76153dbdc8d751a943bc',1,'operator%(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d4e175fcb53cd7926bc3787754faf86',1,'operator%(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)']]], + ['operator_25_3d_100',['operator%=',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae22a90109adc61a7fba881c7f495002f',1,'cv::softdouble::operator%=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4bd168a6fe89d0016b05917d2c067e00',1,'cv::softfloat::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga707e141e760766ca9cbdb6be26941cd4',1,'std::gslice_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaec955c90f1d087dd1a6a2bd41a5cea7a',1,'std::indirect_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa321a7c18f23aae720cdd059ea38fcc2',1,'std::mask_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga51b2370973ce4cfa93b21428c23e3da0',1,'std::slice_array::operator%=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga64fd546424cb6eb21396e7049fb2c17e',1,'std::valarray::operator%=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc5edf2598de6c9bbfe67c8cdc7ff3ab',1,'std::valarray::operator%=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga64fd546424cb6eb21396e7049fb2c17e',1,'valarray< size_t >::operator%=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc5edf2598de6c9bbfe67c8cdc7ff3ab',1,'valarray< size_t >::operator%=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4bd168a6fe89d0016b05917d2c067e00',1,'operator%=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gae22a90109adc61a7fba881c7f495002f',1,'operator%=(const softdouble &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga707e141e760766ca9cbdb6be26941cd4',1,'operator%=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga64fd546424cb6eb21396e7049fb2c17e',1,'operator%=(const _Tp &)(Global Namespace)']]], + ['operator_26_101',['operator&',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad5ca0810ca85918075da95a79d9a97f7',1,'cv::MatExpr::operator&(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac2374f3eaff03e88ed89e166a68d2ae0',1,'cv::MatExpr::operator&(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2a9d86f1b3e1c8840fbcdaedc357c3dc',1,'cv::MatExpr::operator&(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abdc64797e9de5a15144a9c6faff33638',1,'cv::MatExpr::operator&(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab86886f75e72d222c79be0eef13e54ad',1,'cv::MatExpr::operator&(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad5ca0810ca85918075da95a79d9a97f7',1,'cv::MatExpr::operator&(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac2374f3eaff03e88ed89e166a68d2ae0',1,'cv::MatExpr::operator&(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2a9d86f1b3e1c8840fbcdaedc357c3dc',1,'cv::MatExpr::operator&(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abdc64797e9de5a15144a9c6faff33638',1,'cv::MatExpr::operator&(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab86886f75e72d222c79be0eef13e54ad',1,'cv::MatExpr::operator&(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6957bb19d507c40a6915ddd22d1249c4',1,'cv::operator&()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2824fbead5dd62215b4a3962cd3265a3',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac81e02d2c96e3a90c65ce87da156d271',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga144767d1bb4daf6ea0fda36e2e20d4ca',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322dc9a03abc6081db6a879167ebd0c4',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c02de846f3e7774b67e6cb212f91649',1,'cv::cudev::operator&(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691cca0881f07410c194b6b1026a77fb',1,'cv::cudev::operator&(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e44f3fd51a9f96cc64728aa9c30b0e',1,'cv::cudev::operator&(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd9a0060a95f7eaa54e4de45114028ba',1,'cv::cudev::operator&(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5998775c6f8394bae10ff602c588608',1,'cv::cudev::operator&(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f774843bd845f4bc86e06bdb6c31408',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga238c55671d39087ce44545a5ed98ab1c',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab70b9ac4715868342622dd46f9d29d6a',1,'cv::cudev::operator&(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab73b7952cc39f426b985c670ce7f5b52',1,'cv::cudev::operator&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8eae30f62afa2a06307185a43725c74',1,'cv::cudev::operator&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga094b70ca656ab78b3b1f781f929f7567',1,'cv::cudev::operator&(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0913f4f62618507ffc8c0d16251044cd',1,'cv::cudev::operator&(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86dc7c80ee41020ef9ff3b62ae4a2cb6',1,'cv::cudev::operator&(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e6bf0498079e6b9f44052db5b1e89',1,'cv::cudev::operator&(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3476659b715cb17d4c7cb0e217b803d',1,'cv::cudev::operator&(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8498963f3694cb7e5559c1fa089122e',1,'cv::cudev::operator&(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1715d8f7390bd9637882e80d266d8962',1,'cv::cudev::operator&(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad955789a18991c3c601fb6d95cdde9d9',1,'cv::cudev::operator&(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6189769261ab09d9f2f88b0d95d9b69c',1,'cv::cudev::operator&(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47b903733bfaf612b130ab5feaa4e834',1,'cv::cudev::operator&(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6680357b706655b3d4f59ebf6cde1bda',1,'cv::cudev::operator&(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga410ee41519d0e468f977064eca80ca6b',1,'cv::cudev::operator&(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga933b51f3537cb5bd2ca304032f702301',1,'cv::cudev::operator&(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3d2a81a49a5b4ae71bea0e1086650e5',1,'cv::cudev::operator&(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f515f625c04355b920763fbb60934f1',1,'cv::cudev::operator&(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1433b28090a0d04a08045f8de4fecce6',1,'cv::cudev::operator&(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga142e290d05fe7b33f550490478e6bf1c',1,'cv::cudev::operator&(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3956877ec91ef9b8bfd3b4cdf9e7834',1,'cv::cudev::operator&(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d052d31f5b99e648bec17eabcf72643',1,'cv::cudev::operator&(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga447adc88942acc85e431fb7c02584d25',1,'cv::cudev::operator&(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9c66db9a9cfaea6024241e8b1a6acd',1,'cv::cudev::operator&(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d8637568a82c8c300778bd702219d74',1,'cv::cudev::operator&(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga020bb49349993c9d1b6088426f81dfce',1,'cv::cudev::operator&(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50d73894dfb821ab9e3d7aefafed6075',1,'cv::cudev::operator&(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5585ad32954a8f0720a5d88668161ff',1,'cv::cudev::operator&(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7902b60973c6adc297c83152ac0806',1,'cv::cudev::operator&(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0318ec2367da1e372fd5e28b1eab218b',1,'cv::cudev::operator&(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac701681464db5140bc0fab9835f95115',1,'cv::cudev::operator&(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17af2a172ba1fa5938a093c4f9c0eac5',1,'cv::cudev::operator&(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0b49b7d04484f831a731783656099d2',1,'cv::cudev::operator&(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75427aad0e6d9c3c2d6fa9cb246c227d',1,'cv::cudev::operator&(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64f469db78287435cc118baca7fc9a59',1,'cv::cudev::operator&(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44adf7d1bca7f3db25e94fc301c7d678',1,'cv::cudev::operator&(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69834e5b601a5b3bcd816f707b7b3b39',1,'cv::cudev::operator&(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b9761105bb7f9de7916d7d18c7b59bc',1,'cv::cudev::operator&(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab3eb409493f1177554f7cd8a1606318',1,'cv::cudev::operator&(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0eeb6595b46265a3e9bdf9132960798',1,'cv::cudev::operator&(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7977db362f2714454a13ce8be3cf7d35',1,'cv::cudev::operator&(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa25aab84c9af7fcb275c62366cda31ff',1,'cv::cudev::operator&(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd225b01b0b95ad01a57d361b5378ad9',1,'cv::cudev::operator&(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a57e28ab5789a6ab5e3763d7eae3a5e',1,'cv::cudev::operator&(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09703b8694475c3f60d87240ead7ab9c',1,'cv::cudev::operator&(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9250d1f6ecee8ad1dc4b7ca2f8119d7a',1,'cv::cudev::operator&(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga600dc4708da63b278579de8250268fda',1,'cv::cudev::operator&(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12da3f8eecbcdcbdfda3b88b0656de26',1,'cv::cudev::operator&(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72c946da7805977984f0c3e67805271f',1,'cv::cudev::operator&(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12cbff5375b5fe75cb11aa1ceec29e12',1,'cv::cudev::operator&(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e56c435219a48922c9e0bc4dbae5731',1,'cv::cudev::operator&(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f3310022e46b2058670f9d6d9299f39',1,'cv::cudev::operator&(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2d39ebbf206189dc22406a1a2fed139',1,'cv::cudev::operator&(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga068e477cd2843f7b78897fa476592131',1,'cv::cudev::operator&(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51bb0adc5368740ed76777f54a476874',1,'cv::cudev::operator&(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2978c32bb65ec46ca1d351ed7a3eae6',1,'cv::cudev::operator&(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87142039aff3429c8a5a07e52a30f857',1,'cv::cudev::operator&(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cf577b65c982883d6e83281db193dee',1,'cv::cudev::operator&(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8427d79ce048b5397fd13acfe46b0cb8',1,'cv::cudev::operator&(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c00c23cee32f10298bafb1f26393f7b',1,'cv::cudev::operator&(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68e97414257334444f9b1238164108f9',1,'cv::cudev::operator&(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ffa9ba4cd1b5284df92cb84f52d893f',1,'cv::cudev::operator&(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d94fd3ad9493292e1015a141cb3b75',1,'cv::cudev::operator&(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c39d2a806d68167e5bec9b1bef88fa5',1,'cv::cudev::operator&(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa46e182b2a2cf5fb4e36d9872ef0f643',1,'cv::cudev::operator&(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d014dc5b0c60ccbee2f4818a6b2057b',1,'cv::cudev::operator&(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2b5c40d3f569407c9a67bfc1e6b7e89',1,'cv::cudev::operator&(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga099252f9ea434dc03ebd12a8d6ad446e',1,'cv::cudev::operator&(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae242e51d22b353b9ddcff233be97be6f',1,'cv::cudev::operator&(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17e0ec430072e4254a93b539475a5aa1',1,'cv::cudev::operator&(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga883ec5e2401d4cba39d1e4a61b968d94',1,'cv::cudev::operator&(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf31f6fafe2187bc62231e4d0af623cad',1,'cv::cudev::operator&(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc1e6f9244edefd36feff70a5eb86150',1,'cv::cudev::operator&(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab69568bca24e4407e2658ac08a843681',1,'cv::cudev::operator&(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04720d9d8f413cfb21fcb97e53435911',1,'cv::cudev::operator&(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86170e2b7b037f8d980d18f876e72c8d',1,'cv::cudev::operator&(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0707c9dedfd86a692e37e96fe1661ca',1,'cv::cudev::operator&(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6cf168e908a747b46770c3c49cc239',1,'cv::cudev::operator&(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9886a421fb77d7c4b6c69fb3265e3a5b',1,'cv::cudev::operator&(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac32cf95373924bf8cecb00934eeb13ce',1,'cv::cudev::operator&(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac45d05b0b072454d8a1e434bc31a2622',1,'cv::cudev::operator&(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f62603bc29e2ad5f85228039996f9f',1,'cv::cudev::operator&(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf63f98e35a6ecd4b52e32c00aec377ce',1,'cv::cudev::operator&(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga167cfb86156279d9446b2428dfcdf459',1,'cv::cudev::operator&(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19d008f7753dd3651d38cf48c2fef06c',1,'cv::cudev::operator&(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ab76078d3f1909db7086b0360c9fc8b6d',1,'cv::gapi::own::operator&()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6957bb19d507c40a6915ddd22d1249c4',1,'operator&(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2824fbead5dd62215b4a3962cd3265a3',1,'operator&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac81e02d2c96e3a90c65ce87da156d271',1,'operator&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga144767d1bb4daf6ea0fda36e2e20d4ca',1,'operator&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322dc9a03abc6081db6a879167ebd0c4',1,'operator&(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c02de846f3e7774b67e6cb212f91649',1,'operator&(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga691cca0881f07410c194b6b1026a77fb',1,'operator&(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e44f3fd51a9f96cc64728aa9c30b0e',1,'operator&(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd9a0060a95f7eaa54e4de45114028ba',1,'operator&(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5998775c6f8394bae10ff602c588608',1,'operator&(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f774843bd845f4bc86e06bdb6c31408',1,'operator&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga238c55671d39087ce44545a5ed98ab1c',1,'operator&(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab70b9ac4715868342622dd46f9d29d6a',1,'operator&(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab73b7952cc39f426b985c670ce7f5b52',1,'operator&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8eae30f62afa2a06307185a43725c74',1,'operator&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga094b70ca656ab78b3b1f781f929f7567',1,'operator&(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0913f4f62618507ffc8c0d16251044cd',1,'operator&(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86dc7c80ee41020ef9ff3b62ae4a2cb6',1,'operator&(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e6bf0498079e6b9f44052db5b1e89',1,'operator&(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3476659b715cb17d4c7cb0e217b803d',1,'operator&(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8498963f3694cb7e5559c1fa089122e',1,'operator&(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1715d8f7390bd9637882e80d266d8962',1,'operator&(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad955789a18991c3c601fb6d95cdde9d9',1,'operator&(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6189769261ab09d9f2f88b0d95d9b69c',1,'operator&(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47b903733bfaf612b130ab5feaa4e834',1,'operator&(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6680357b706655b3d4f59ebf6cde1bda',1,'operator&(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga410ee41519d0e468f977064eca80ca6b',1,'operator&(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga933b51f3537cb5bd2ca304032f702301',1,'operator&(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3d2a81a49a5b4ae71bea0e1086650e5',1,'operator&(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f515f625c04355b920763fbb60934f1',1,'operator&(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1433b28090a0d04a08045f8de4fecce6',1,'operator&(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga142e290d05fe7b33f550490478e6bf1c',1,'operator&(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3956877ec91ef9b8bfd3b4cdf9e7834',1,'operator&(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d052d31f5b99e648bec17eabcf72643',1,'operator&(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga447adc88942acc85e431fb7c02584d25',1,'operator&(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9c66db9a9cfaea6024241e8b1a6acd',1,'operator&(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7d8637568a82c8c300778bd702219d74',1,'operator&(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga020bb49349993c9d1b6088426f81dfce',1,'operator&(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50d73894dfb821ab9e3d7aefafed6075',1,'operator&(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5585ad32954a8f0720a5d88668161ff',1,'operator&(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7902b60973c6adc297c83152ac0806',1,'operator&(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0318ec2367da1e372fd5e28b1eab218b',1,'operator&(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac701681464db5140bc0fab9835f95115',1,'operator&(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17af2a172ba1fa5938a093c4f9c0eac5',1,'operator&(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0b49b7d04484f831a731783656099d2',1,'operator&(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75427aad0e6d9c3c2d6fa9cb246c227d',1,'operator&(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64f469db78287435cc118baca7fc9a59',1,'operator&(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44adf7d1bca7f3db25e94fc301c7d678',1,'operator&(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69834e5b601a5b3bcd816f707b7b3b39',1,'operator&(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b9761105bb7f9de7916d7d18c7b59bc',1,'operator&(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab3eb409493f1177554f7cd8a1606318',1,'operator&(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0eeb6595b46265a3e9bdf9132960798',1,'operator&(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7977db362f2714454a13ce8be3cf7d35',1,'operator&(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa25aab84c9af7fcb275c62366cda31ff',1,'operator&(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd225b01b0b95ad01a57d361b5378ad9',1,'operator&(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a57e28ab5789a6ab5e3763d7eae3a5e',1,'operator&(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09703b8694475c3f60d87240ead7ab9c',1,'operator&(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9250d1f6ecee8ad1dc4b7ca2f8119d7a',1,'operator&(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga600dc4708da63b278579de8250268fda',1,'operator&(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12da3f8eecbcdcbdfda3b88b0656de26',1,'operator&(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72c946da7805977984f0c3e67805271f',1,'operator&(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12cbff5375b5fe75cb11aa1ceec29e12',1,'operator&(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e56c435219a48922c9e0bc4dbae5731',1,'operator&(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f3310022e46b2058670f9d6d9299f39',1,'operator&(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2d39ebbf206189dc22406a1a2fed139',1,'operator&(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga068e477cd2843f7b78897fa476592131',1,'operator&(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51bb0adc5368740ed76777f54a476874',1,'operator&(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2978c32bb65ec46ca1d351ed7a3eae6',1,'operator&(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87142039aff3429c8a5a07e52a30f857',1,'operator&(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cf577b65c982883d6e83281db193dee',1,'operator&(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8427d79ce048b5397fd13acfe46b0cb8',1,'operator&(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c00c23cee32f10298bafb1f26393f7b',1,'operator&(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68e97414257334444f9b1238164108f9',1,'operator&(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ffa9ba4cd1b5284df92cb84f52d893f',1,'operator&(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d94fd3ad9493292e1015a141cb3b75',1,'operator&(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c39d2a806d68167e5bec9b1bef88fa5',1,'operator&(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa46e182b2a2cf5fb4e36d9872ef0f643',1,'operator&(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d014dc5b0c60ccbee2f4818a6b2057b',1,'operator&(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac2b5c40d3f569407c9a67bfc1e6b7e89',1,'operator&(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga099252f9ea434dc03ebd12a8d6ad446e',1,'operator&(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae242e51d22b353b9ddcff233be97be6f',1,'operator&(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17e0ec430072e4254a93b539475a5aa1',1,'operator&(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga883ec5e2401d4cba39d1e4a61b968d94',1,'operator&(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf31f6fafe2187bc62231e4d0af623cad',1,'operator&(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc1e6f9244edefd36feff70a5eb86150',1,'operator&(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab69568bca24e4407e2658ac08a843681',1,'operator&(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04720d9d8f413cfb21fcb97e53435911',1,'operator&(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86170e2b7b037f8d980d18f876e72c8d',1,'operator&(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0707c9dedfd86a692e37e96fe1661ca',1,'operator&(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d6cf168e908a747b46770c3c49cc239',1,'operator&(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9886a421fb77d7c4b6c69fb3265e3a5b',1,'operator&(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac32cf95373924bf8cecb00934eeb13ce',1,'operator&(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac45d05b0b072454d8a1e434bc31a2622',1,'operator&(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f62603bc29e2ad5f85228039996f9f',1,'operator&(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf63f98e35a6ecd4b52e32c00aec377ce',1,'operator&(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga167cfb86156279d9446b2428dfcdf459',1,'operator&(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19d008f7753dd3651d38cf48c2fef06c',1,'operator&(const uint4 &a, uint s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0bad6c26bf52fd395038f073e09423b9',1,'std::operator&()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#aa181d58777df9e46fdd8b6cf08dd12c3',1,'std::regex_constants::operator&(syntax_option_type __a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a91f43c51d82f4484019c321d420a9fa3',1,'std::regex_constants::operator&(match_flag_type __a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gacc832712a19ae288e2b01ba85bee3d5a',1,'std::tr2::operator&()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gacc832712a19ae288e2b01ba85bee3d5a',1,'operator&()(Global Namespace)']]], + ['operator_26_26_102',['operator&&',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9daa85a8c304bfe871adc47da30a4075',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c3601d795120192cba3966eae171f10',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3bdc6d15e263a0dabfd93f5c2e4b65f',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad06b1219c0854f5f7bb80f38df9d8cb4',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga897646556f5a3a133b41494b371b484b',1,'cv::cudev::operator&&(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa883a73a52c65d1e648c2f8844352ceb',1,'cv::cudev::operator&&(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468fd922ef425cca9d9ec40fc702cc52',1,'cv::cudev::operator&&(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2816ac7d00137b8a6631c13355bbf84d',1,'cv::cudev::operator&&(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3a1b877260a04e1c1664908d89f87c1',1,'cv::cudev::operator&&(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51ac89a7446501931038d95fca430398',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987ac6dfee9f13d1365e8741da3ea37a',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace124f27b31537a2901a0dfa2c5a52ba',1,'cv::cudev::operator&&(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508b443e9fd9a0b93d9ae46f85a64edb',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2048cae02db953f223509133d6c274da',1,'cv::cudev::operator&&(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6e25ae76fb3499ae0e9655b6fa6c5d4',1,'cv::cudev::operator&&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc7b300e441c12d3f877fbba0f640f91',1,'cv::cudev::operator&&(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6df462ce5ffc9b3ee0fe42b1fc3bfb0f',1,'cv::cudev::operator&&(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfa8ff8614d4e00b93ee2d759819a4cb',1,'cv::cudev::operator&&(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dd173482aba8974fc0592b0c25f3c2',1,'cv::cudev::operator&&(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac76e6288a150f76f61a2824840344e7b',1,'cv::cudev::operator&&(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9be5fb383bfaf67c9bc2af53e6ae445',1,'cv::cudev::operator&&(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cee20c36d3655a18dae9c643a08db82',1,'cv::cudev::operator&&(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65a91568d8a8069dbd33c5f48ef8e691',1,'cv::cudev::operator&&(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac51b458c5da2918473fee75cb6e10955',1,'cv::cudev::operator&&(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56cf2aa63abdf862d31098458753edbb',1,'cv::cudev::operator&&(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dc1d206c05395102ddc5a1a287461e',1,'cv::cudev::operator&&(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990451138951363139dd592adce0ff78',1,'cv::cudev::operator&&(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae22e605f6aff9ef0a408e0caa81925ec',1,'cv::cudev::operator&&(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc48e8ac73e455ef8bd4b6f830280f09',1,'cv::cudev::operator&&(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a58600dc51ddd5a9609e2ebd5e2fbca',1,'cv::cudev::operator&&(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e50d6f24de8bf739a28d4f25dcc791b',1,'cv::cudev::operator&&(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa394cdb2ec6fa3211a4a76c8dd2d849e',1,'cv::cudev::operator&&(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7c5a779467e224a84de95a4cf906ae4',1,'cv::cudev::operator&&(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9a6d566256f6915d183f3a8ac8b85ba',1,'cv::cudev::operator&&(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff4f4526f76a68ac06eadc1b0a6be0c',1,'cv::cudev::operator&&(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a9ddd3b6a9e3f208a416bed9990c4e',1,'cv::cudev::operator&&(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755ae4826d5870d832393255b0922921',1,'cv::cudev::operator&&(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ba3e08f2b0c31afc32421751f1f80d',1,'cv::cudev::operator&&(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f917aa69f90085189ec9e06612bfa07',1,'cv::cudev::operator&&(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7916e11ea81ef8251fe45d086c96be20',1,'cv::cudev::operator&&(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b05c87a1d20f8b880ab6cbda2db9bd3',1,'cv::cudev::operator&&(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d8edae6372de657170a6d8503e50546',1,'cv::cudev::operator&&(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga597ef8e3f532caf8cf102750203625dc',1,'cv::cudev::operator&&(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dab250b0b130cd0128d02fec06b4842',1,'cv::cudev::operator&&(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c9e483c92927b8a6ebede43d4413a1',1,'cv::cudev::operator&&(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76c52d8fb9195ffbc8e724038305864f',1,'cv::cudev::operator&&(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf943568be0acae96b5b025b73efec7fb',1,'cv::cudev::operator&&(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5eba7700c8b81b388425b3d0b138c6f',1,'cv::cudev::operator&&(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac16ec172d052e95bbf324345dac02567',1,'cv::cudev::operator&&(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0885c4984c4251641df3bc3f2720ac90',1,'cv::cudev::operator&&(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a132cd81a7e17cdb05f15ed4d04c810',1,'cv::cudev::operator&&(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga784e168129bc4fce6b3f7c17ed5fc70d',1,'cv::cudev::operator&&(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdfe6638006d040dd4c446f2e0a2394',1,'cv::cudev::operator&&(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6376582bf0339f0b9c9388fadc8d8ca4',1,'cv::cudev::operator&&(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafce02da16b670515cf35ac56ef70f550',1,'cv::cudev::operator&&(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga173fe35e9054cb5a39aa6e8880866cda',1,'cv::cudev::operator&&(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e115f94ba7670c47892d29058840e15',1,'cv::cudev::operator&&(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e28550c974cc909cb44d798988cce12',1,'cv::cudev::operator&&(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cc212c7d51a10bcbd8b7f0156160fe3',1,'cv::cudev::operator&&(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec57a07d4d17363ae5e7e387fcea30a0',1,'cv::cudev::operator&&(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f3a4fb3fa1532375e8890053394ab03',1,'cv::cudev::operator&&(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3986bd1d079a19f0f4ec3255a74c748',1,'cv::cudev::operator&&(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f3bd5cbe1e0bf123190c0a600eed871',1,'cv::cudev::operator&&(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9456d12d1542746d8289926ca17494c2',1,'cv::cudev::operator&&(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a553dd9208cba98dba26d25074ea3fc',1,'cv::cudev::operator&&(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9752fe7958a740cea43e4f5bd4f1a15',1,'cv::cudev::operator&&(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaece716a600686f5b9781ec870ea442f0',1,'cv::cudev::operator&&(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4573fd86b5ee0040383fd285235a066d',1,'cv::cudev::operator&&(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75403ae82171c1a3eae6dbeefb12dc02',1,'cv::cudev::operator&&(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31c1bf92bb175a9fa8596c438db86014',1,'cv::cudev::operator&&(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74734139f4f10325d11fe6a9085279e1',1,'cv::cudev::operator&&(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25395032ad06d8e8c445079cb8e9aa42',1,'cv::cudev::operator&&(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6a649ac42b67feb71003beddbacd7f0',1,'cv::cudev::operator&&(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31766171823163be81c9b812569822e6',1,'cv::cudev::operator&&(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2a9aee1a3645f4251ce647c2927d452',1,'cv::cudev::operator&&(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada168ab6107bd0ccfd2bd501f3e277f3',1,'cv::cudev::operator&&(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b4509b995583bc214680c6327af30e0',1,'cv::cudev::operator&&(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8006f3728e9e0df5a7f72765d207b406',1,'cv::cudev::operator&&(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30b7bb6d73291c7482998899eb14d144',1,'cv::cudev::operator&&(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ddc4cbc632339a238fb6d9ed1b9a5ca',1,'cv::cudev::operator&&(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59c31536e15ee1bfcc9e0a2a2babbb44',1,'cv::cudev::operator&&(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4122355804f4d7068d2c3e727f060c69',1,'cv::cudev::operator&&(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56ceb64916924c2b210aeeeea43cb93',1,'cv::cudev::operator&&(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee9ad5547e1a27092cd79622c56ac2b7',1,'cv::cudev::operator&&(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a48ccd60d6b596798654adec10cbda0',1,'cv::cudev::operator&&(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9f44a6c26c30d6a39bc45a623dc6a3',1,'cv::cudev::operator&&(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cb948715ea292618e5672820cebed45',1,'cv::cudev::operator&&(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae559d6cf14a6c96295a07c18a2321b33',1,'cv::cudev::operator&&(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8344d3ce2cc4c18da8df795fad1b52dc',1,'cv::cudev::operator&&(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6253898eb552c062075101942a691a7d',1,'cv::cudev::operator&&(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea4896818580da7de435628d403ce426',1,'cv::cudev::operator&&(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31e5d68382677b0c792f7fa1e545dff8',1,'cv::cudev::operator&&(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18c7b7f2c8ebb8b829ae0bd902548e58',1,'cv::cudev::operator&&(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga944653cf7179a84fc232c65418c805f7',1,'cv::cudev::operator&&(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d7df31c53c8e4dc9e0cadc7af19c732',1,'cv::cudev::operator&&(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0651016efcb1cdcac924fb59ac451c7e',1,'cv::cudev::operator&&(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c62e689f10955a1f4befb6fee373e8',1,'cv::cudev::operator&&(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d63e056e39e0fb89da997f16611a635',1,'cv::cudev::operator&&(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6744338561d677971b9c536a5065ed37',1,'cv::cudev::operator&&(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee44cddc9a95fb7d5fd14c3a904ac916',1,'cv::cudev::operator&&(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9a63465a3fce79c26a75e054f67b0c8',1,'cv::cudev::operator&&(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1418091ec7fc32cf9df83c3b33157652',1,'cv::cudev::operator&&(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f8e32c315622cd29f644906a8fb699c',1,'cv::cudev::operator&&(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b14278109d0129e03a1c122f34a400b',1,'cv::cudev::operator&&(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad24b233b709002378ddab84ebab7b8c1',1,'cv::cudev::operator&&(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7881e75bb7e5519030f9c27966e4bbc9',1,'cv::cudev::operator&&(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab59a4f1aaebaeb0ab30d236cd90ea438',1,'cv::cudev::operator&&(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16e626f8b9952b0a82fd931686d9e98a',1,'cv::cudev::operator&&(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad6bb786a45b9412453e93239972519',1,'cv::cudev::operator&&(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga918585aac4816c3ce968d179cfcfb6c9',1,'cv::cudev::operator&&(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08df2d9887291e206d3f0f42a313a220',1,'cv::cudev::operator&&(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga543d7d06fea6a02e66ecef2710cb7608',1,'cv::cudev::operator&&(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84ee73980b0845219731857a6ea350c1',1,'cv::cudev::operator&&(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ffc399abd2fb9fc96bb9700e5d5ebd',1,'cv::cudev::operator&&(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6287e06b541f138ea8c3ff9744299b2a',1,'cv::cudev::operator&&(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad006a6b3d0f83b95d337925f808bb9a0',1,'cv::cudev::operator&&(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5b87c6df19abe0807b867a8055d7210',1,'cv::cudev::operator&&(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9bf69d4894e48fe280fb7af235ee729',1,'cv::cudev::operator&&(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48663d644513466290e6c1b1467bafdb',1,'cv::cudev::operator&&(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60d7bf69aabe9bbe43a43ebc656471bd',1,'cv::cudev::operator&&(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9daa85a8c304bfe871adc47da30a4075',1,'operator&&(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c3601d795120192cba3966eae171f10',1,'operator&&(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3bdc6d15e263a0dabfd93f5c2e4b65f',1,'operator&&(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad06b1219c0854f5f7bb80f38df9d8cb4',1,'operator&&(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga897646556f5a3a133b41494b371b484b',1,'operator&&(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa883a73a52c65d1e648c2f8844352ceb',1,'operator&&(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468fd922ef425cca9d9ec40fc702cc52',1,'operator&&(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2816ac7d00137b8a6631c13355bbf84d',1,'operator&&(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3a1b877260a04e1c1664908d89f87c1',1,'operator&&(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51ac89a7446501931038d95fca430398',1,'operator&&(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987ac6dfee9f13d1365e8741da3ea37a',1,'operator&&(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace124f27b31537a2901a0dfa2c5a52ba',1,'operator&&(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508b443e9fd9a0b93d9ae46f85a64edb',1,'operator&&(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2048cae02db953f223509133d6c274da',1,'operator&&(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6e25ae76fb3499ae0e9655b6fa6c5d4',1,'operator&&(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc7b300e441c12d3f877fbba0f640f91',1,'operator&&(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6df462ce5ffc9b3ee0fe42b1fc3bfb0f',1,'operator&&(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfa8ff8614d4e00b93ee2d759819a4cb',1,'operator&&(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15dd173482aba8974fc0592b0c25f3c2',1,'operator&&(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac76e6288a150f76f61a2824840344e7b',1,'operator&&(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9be5fb383bfaf67c9bc2af53e6ae445',1,'operator&&(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cee20c36d3655a18dae9c643a08db82',1,'operator&&(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65a91568d8a8069dbd33c5f48ef8e691',1,'operator&&(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac51b458c5da2918473fee75cb6e10955',1,'operator&&(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56cf2aa63abdf862d31098458753edbb',1,'operator&&(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dc1d206c05395102ddc5a1a287461e',1,'operator&&(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990451138951363139dd592adce0ff78',1,'operator&&(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae22e605f6aff9ef0a408e0caa81925ec',1,'operator&&(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc48e8ac73e455ef8bd4b6f830280f09',1,'operator&&(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a58600dc51ddd5a9609e2ebd5e2fbca',1,'operator&&(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e50d6f24de8bf739a28d4f25dcc791b',1,'operator&&(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa394cdb2ec6fa3211a4a76c8dd2d849e',1,'operator&&(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7c5a779467e224a84de95a4cf906ae4',1,'operator&&(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9a6d566256f6915d183f3a8ac8b85ba',1,'operator&&(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff4f4526f76a68ac06eadc1b0a6be0c',1,'operator&&(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a9ddd3b6a9e3f208a416bed9990c4e',1,'operator&&(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755ae4826d5870d832393255b0922921',1,'operator&&(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ba3e08f2b0c31afc32421751f1f80d',1,'operator&&(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f917aa69f90085189ec9e06612bfa07',1,'operator&&(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7916e11ea81ef8251fe45d086c96be20',1,'operator&&(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b05c87a1d20f8b880ab6cbda2db9bd3',1,'operator&&(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d8edae6372de657170a6d8503e50546',1,'operator&&(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga597ef8e3f532caf8cf102750203625dc',1,'operator&&(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dab250b0b130cd0128d02fec06b4842',1,'operator&&(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c9e483c92927b8a6ebede43d4413a1',1,'operator&&(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76c52d8fb9195ffbc8e724038305864f',1,'operator&&(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf943568be0acae96b5b025b73efec7fb',1,'operator&&(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5eba7700c8b81b388425b3d0b138c6f',1,'operator&&(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac16ec172d052e95bbf324345dac02567',1,'operator&&(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0885c4984c4251641df3bc3f2720ac90',1,'operator&&(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a132cd81a7e17cdb05f15ed4d04c810',1,'operator&&(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga784e168129bc4fce6b3f7c17ed5fc70d',1,'operator&&(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdfe6638006d040dd4c446f2e0a2394',1,'operator&&(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6376582bf0339f0b9c9388fadc8d8ca4',1,'operator&&(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafce02da16b670515cf35ac56ef70f550',1,'operator&&(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga173fe35e9054cb5a39aa6e8880866cda',1,'operator&&(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e115f94ba7670c47892d29058840e15',1,'operator&&(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e28550c974cc909cb44d798988cce12',1,'operator&&(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cc212c7d51a10bcbd8b7f0156160fe3',1,'operator&&(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec57a07d4d17363ae5e7e387fcea30a0',1,'operator&&(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f3a4fb3fa1532375e8890053394ab03',1,'operator&&(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3986bd1d079a19f0f4ec3255a74c748',1,'operator&&(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f3bd5cbe1e0bf123190c0a600eed871',1,'operator&&(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9456d12d1542746d8289926ca17494c2',1,'operator&&(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a553dd9208cba98dba26d25074ea3fc',1,'operator&&(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9752fe7958a740cea43e4f5bd4f1a15',1,'operator&&(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaece716a600686f5b9781ec870ea442f0',1,'operator&&(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4573fd86b5ee0040383fd285235a066d',1,'operator&&(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75403ae82171c1a3eae6dbeefb12dc02',1,'operator&&(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31c1bf92bb175a9fa8596c438db86014',1,'operator&&(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74734139f4f10325d11fe6a9085279e1',1,'operator&&(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25395032ad06d8e8c445079cb8e9aa42',1,'operator&&(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6a649ac42b67feb71003beddbacd7f0',1,'operator&&(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31766171823163be81c9b812569822e6',1,'operator&&(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2a9aee1a3645f4251ce647c2927d452',1,'operator&&(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gada168ab6107bd0ccfd2bd501f3e277f3',1,'operator&&(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b4509b995583bc214680c6327af30e0',1,'operator&&(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8006f3728e9e0df5a7f72765d207b406',1,'operator&&(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30b7bb6d73291c7482998899eb14d144',1,'operator&&(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ddc4cbc632339a238fb6d9ed1b9a5ca',1,'operator&&(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59c31536e15ee1bfcc9e0a2a2babbb44',1,'operator&&(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4122355804f4d7068d2c3e727f060c69',1,'operator&&(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56ceb64916924c2b210aeeeea43cb93',1,'operator&&(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee9ad5547e1a27092cd79622c56ac2b7',1,'operator&&(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a48ccd60d6b596798654adec10cbda0',1,'operator&&(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b9f44a6c26c30d6a39bc45a623dc6a3',1,'operator&&(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cb948715ea292618e5672820cebed45',1,'operator&&(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae559d6cf14a6c96295a07c18a2321b33',1,'operator&&(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8344d3ce2cc4c18da8df795fad1b52dc',1,'operator&&(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6253898eb552c062075101942a691a7d',1,'operator&&(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea4896818580da7de435628d403ce426',1,'operator&&(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31e5d68382677b0c792f7fa1e545dff8',1,'operator&&(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18c7b7f2c8ebb8b829ae0bd902548e58',1,'operator&&(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga944653cf7179a84fc232c65418c805f7',1,'operator&&(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d7df31c53c8e4dc9e0cadc7af19c732',1,'operator&&(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0651016efcb1cdcac924fb59ac451c7e',1,'operator&&(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c62e689f10955a1f4befb6fee373e8',1,'operator&&(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d63e056e39e0fb89da997f16611a635',1,'operator&&(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6744338561d677971b9c536a5065ed37',1,'operator&&(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee44cddc9a95fb7d5fd14c3a904ac916',1,'operator&&(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9a63465a3fce79c26a75e054f67b0c8',1,'operator&&(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1418091ec7fc32cf9df83c3b33157652',1,'operator&&(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f8e32c315622cd29f644906a8fb699c',1,'operator&&(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b14278109d0129e03a1c122f34a400b',1,'operator&&(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad24b233b709002378ddab84ebab7b8c1',1,'operator&&(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7881e75bb7e5519030f9c27966e4bbc9',1,'operator&&(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab59a4f1aaebaeb0ab30d236cd90ea438',1,'operator&&(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16e626f8b9952b0a82fd931686d9e98a',1,'operator&&(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad6bb786a45b9412453e93239972519',1,'operator&&(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga918585aac4816c3ce968d179cfcfb6c9',1,'operator&&(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08df2d9887291e206d3f0f42a313a220',1,'operator&&(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga543d7d06fea6a02e66ecef2710cb7608',1,'operator&&(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84ee73980b0845219731857a6ea350c1',1,'operator&&(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ffc399abd2fb9fc96bb9700e5d5ebd',1,'operator&&(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6287e06b541f138ea8c3ff9744299b2a',1,'operator&&(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad006a6b3d0f83b95d337925f808bb9a0',1,'operator&&(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5b87c6df19abe0807b867a8055d7210',1,'operator&&(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9bf69d4894e48fe280fb7af235ee729',1,'operator&&(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48663d644513466290e6c1b1467bafdb',1,'operator&&(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60d7bf69aabe9bbe43a43ebc656471bd',1,'operator&&(double s, const double2 &b)(Global Namespace)']]], + ['operator_26_3d_103',['operator&=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aaeeeb77b0bef34eb4eacb3905e09a561',1,'std::bitset::operator&=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aaeeeb77b0bef34eb4eacb3905e09a561',1,'std::bitset::operator&=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaca009c69acad92ea0f2244082487b32b',1,'std::gslice_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9a195965bc454b815b4035618de3f5ba',1,'std::indirect_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga243e78b1748d74ed3d4be27c8839fb87',1,'std::mask_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc4123a878dbaee0b0e8dea7aeb7216c',1,'std::slice_array::operator&=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae775a70aa50343f7e0d12bec75dcdd2b',1,'std::tr2::dynamic_bitset::operator&=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab623bb2bba98884ae7c3eccd227d5459',1,'std::tr2::dynamic_bitset::operator&=(dynamic_bitset &&__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae775a70aa50343f7e0d12bec75dcdd2b',1,'std::tr2::dynamic_bitset::operator&=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab623bb2bba98884ae7c3eccd227d5459',1,'std::tr2::dynamic_bitset::operator&=(dynamic_bitset &&__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6eacabfbf6099e64331966308185f957',1,'std::valarray::operator&=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafc4fe2eb569b9bca46e799f3ecb0609c',1,'std::valarray::operator&=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6eacabfbf6099e64331966308185f957',1,'valarray< size_t >::operator&=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafc4fe2eb569b9bca46e799f3ecb0609c',1,'valarray< size_t >::operator&=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1c36b9548296f20d3382808c82122ca3',1,'cv::operator&=()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#adaba058bb9999abb04506b319aff5011',1,'cv::gapi::own::operator&=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1c36b9548296f20d3382808c82122ca3',1,'operator&=()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a0ac5601f07c5581e7cc3efd6ce6a9d4f',1,'std::regex_constants::operator&=(syntax_option_type &__a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#adf8b32ecec86f9328d9e77ea918d5bd7',1,'std::regex_constants::operator&=(match_flag_type &__a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaca009c69acad92ea0f2244082487b32b',1,'operator&=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6eacabfbf6099e64331966308185f957',1,'operator&=(const _Tp &)(Global Namespace)']]], + ['operator_28_29_104',['operator()',['https://docs.opencv.org/4.2.0/da/d32/structcv_1_1cudev_1_1abs__func.html#a94901ba987a4b13f76d6c512ff67630f',1,'cv::cudev::abs_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/d17/structcv_1_1cudev_1_1abs__func_3_01double_01_4.html#a09324ee98e693e096ffbf16186d54406',1,'cv::cudev::abs_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d75/structcv_1_1cudev_1_1abs__func_3_01float_01_4.html#a61ef7062be465ef121b724f7c612e100',1,'cv::cudev::abs_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d3/dc9/structcv_1_1cudev_1_1abs__func_3_01schar_01_4.html#a33a00f9fd47140d763c362d2d8754ef5',1,'cv::cudev::abs_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d2b/structcv_1_1cudev_1_1abs__func_3_01short_01_4.html#ab273409438d23ecf6a7deee0a1ceb338',1,'cv::cudev::abs_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d6e/structcv_1_1cudev_1_1abs__func_3_01uchar_01_4.html#a087883df9c5e8aa99a6e686a2a42ee30',1,'cv::cudev::abs_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d98/structcv_1_1cudev_1_1abs__func_3_01uint_01_4.html#a6194e5eba6a05ab9fef48ef29855ad22',1,'cv::cudev::abs_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/da7/structcv_1_1cudev_1_1abs__func_3_01ushort_01_4.html#a230f31a23cac7d7b75e8f1b8b32ad1dc',1,'cv::cudev::abs_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/da1/structcv_1_1cudev_1_1absdiff__func.html#ab501011fd7f3950a7db1bff0e6c4f739',1,'cv::cudev::absdiff_func::operator()()'],['https://docs.opencv.org/4.2.0/de/dae/structcv_1_1cudev_1_1acos__func.html#a00573ba47210264bc9812c7e2fbb1676',1,'cv::cudev::acos_func::operator()()'],['https://docs.opencv.org/4.2.0/d0/d62/structcv_1_1cudev_1_1acos__func_3_01double_01_4.html#a35dd825ad75c47ace1929b2b478705cb',1,'cv::cudev::acos_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd0/structcv_1_1cudev_1_1acos__func_3_01float_01_4.html#a72e654a25abffc81ac465c0b62f751ab',1,'cv::cudev::acos_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d4/dc1/structcv_1_1cudev_1_1acos__func_3_01schar_01_4.html#a751cd34b926ea535d1c4ae85115b3ad3',1,'cv::cudev::acos_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d80/structcv_1_1cudev_1_1acos__func_3_01short_01_4.html#ab8a75a695c451fee16cf582bb37be3a7',1,'cv::cudev::acos_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1acos__func_3_01uchar_01_4.html#a41864404742e2b57a5d61bfaedc6930b',1,'cv::cudev::acos_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dc0/structcv_1_1cudev_1_1acos__func_3_01uint_01_4.html#af21480a7802d4fcdb548d815d2732108',1,'cv::cudev::acos_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/de/d57/structcv_1_1cudev_1_1acos__func_3_01ushort_01_4.html#ace440e4c06446bf686bdf56aaa61e370',1,'cv::cudev::acos_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/da/d97/structcv_1_1cudev_1_1acosh__func.html#a6902cdcdfeff1b7173d4cfffd32d7e03',1,'cv::cudev::acosh_func::operator()()'],['https://docs.opencv.org/4.2.0/d6/de9/structcv_1_1cudev_1_1acosh__func_3_01double_01_4.html#adcdbcc1362f625ca203505bc291a8a3c',1,'cv::cudev::acosh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/de/d89/structcv_1_1cudev_1_1acosh__func_3_01float_01_4.html#a8982e72923a845633808910076483761',1,'cv::cudev::acosh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d52/structcv_1_1cudev_1_1acosh__func_3_01schar_01_4.html#ae815dc363c798f86c639fdbee64d53dc',1,'cv::cudev::acosh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d61/structcv_1_1cudev_1_1acosh__func_3_01short_01_4.html#a7591548bc937a985b6beb8f616ed3eed',1,'cv::cudev::acosh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d17/structcv_1_1cudev_1_1acosh__func_3_01uchar_01_4.html#ab9166b320e5284bbc93311576451082f',1,'cv::cudev::acosh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/de/d8f/structcv_1_1cudev_1_1acosh__func_3_01uint_01_4.html#ae1379c0c1004182761438b8759767f55',1,'cv::cudev::acosh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/db8/structcv_1_1cudev_1_1acosh__func_3_01ushort_01_4.html#aa7121ef1b36d0b4308d6fb954af64194',1,'cv::cudev::acosh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d2a/structcv_1_1cudev_1_1AffineMapPtr.html#a4445dd8e26b3ab12dd94b0a03459f8c7',1,'cv::cudev::AffineMapPtr::operator()()'],['https://docs.opencv.org/4.2.0/d9/dee/structcv_1_1cudev_1_1asin__func.html#ad0dadefec255a3fab08b7b6951976147',1,'cv::cudev::asin_func::operator()()'],['https://docs.opencv.org/4.2.0/d6/d59/structcv_1_1cudev_1_1asin__func_3_01double_01_4.html#ae6b289475377426443000524d7c90085',1,'cv::cudev::asin_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d96/structcv_1_1cudev_1_1asin__func_3_01float_01_4.html#a96523634a121003c18ef94ff4034e750',1,'cv::cudev::asin_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d9/da3/structcv_1_1cudev_1_1asin__func_3_01schar_01_4.html#a0894abd85f1e7283ec0d7987e83870a4',1,'cv::cudev::asin_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d16/structcv_1_1cudev_1_1asin__func_3_01short_01_4.html#ac71145c2171d2ac723c9ea4bc122fd2d',1,'cv::cudev::asin_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/da/d71/structcv_1_1cudev_1_1asin__func_3_01uchar_01_4.html#a6de9805df271a327d045d0423d9b0b7f',1,'cv::cudev::asin_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d65/structcv_1_1cudev_1_1asin__func_3_01uint_01_4.html#a67ae0549ed7d2d8bfcf3f12fbe27f0d9',1,'cv::cudev::asin_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d46/structcv_1_1cudev_1_1asin__func_3_01ushort_01_4.html#ae72849100ba9499ef28b6474b147c639',1,'cv::cudev::asin_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d43/structcv_1_1cudev_1_1asinh__func.html#a3dfa1b292a19d188f40bfe6023044c77',1,'cv::cudev::asinh_func::operator()()'],['https://docs.opencv.org/4.2.0/d7/da8/structcv_1_1cudev_1_1asinh__func_3_01double_01_4.html#ae1635d4b05cded16135c4fdf03708e55',1,'cv::cudev::asinh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d1c/structcv_1_1cudev_1_1asinh__func_3_01float_01_4.html#a854f649e9681f1e6f1c5ae814e53f729',1,'cv::cudev::asinh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/db/db5/structcv_1_1cudev_1_1asinh__func_3_01schar_01_4.html#a6884224d8c6774ded501395c72fbe5c2',1,'cv::cudev::asinh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/df/da7/structcv_1_1cudev_1_1asinh__func_3_01short_01_4.html#aef45a37522498495bf0a4f6ccb55f1cf',1,'cv::cudev::asinh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1cudev_1_1asinh__func_3_01uchar_01_4.html#abe9fca6c5fc501aebd16b35ccdef9dcb',1,'cv::cudev::asinh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d27/structcv_1_1cudev_1_1asinh__func_3_01uint_01_4.html#ae8758ca4e6f926650c902e84e762a2a3',1,'cv::cudev::asinh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dc2/structcv_1_1cudev_1_1asinh__func_3_01ushort_01_4.html#a187311528ee4b3a4be24935b2a0a0c70',1,'cv::cudev::asinh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d8e/structcv_1_1cudev_1_1atan2__func.html#a11d690fd0a2f0d1169808d70e768c7b9',1,'cv::cudev::atan2_func::operator()()'],['https://docs.opencv.org/4.2.0/d8/d15/structcv_1_1cudev_1_1atan2__func_3_01double_01_4.html#ab78ab22ad26665bd7c9832006b3f39b0',1,'cv::cudev::atan2_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d0/df1/structcv_1_1cudev_1_1atan2__func_3_01float_01_4.html#a90ec967495f0b7d8067ca7a8256b0dfe',1,'cv::cudev::atan2_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/da/da9/structcv_1_1cudev_1_1atan2__func_3_01schar_01_4.html#abbf914a1e06e67bbd24d10519212b0b4',1,'cv::cudev::atan2_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d9/dc9/structcv_1_1cudev_1_1atan2__func_3_01short_01_4.html#a2a2a614f5878ff865689740cb2068161',1,'cv::cudev::atan2_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d3/d1d/structcv_1_1cudev_1_1atan2__func_3_01uchar_01_4.html#a13984771ed43545e79b89929980d1e12',1,'cv::cudev::atan2_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d4a/structcv_1_1cudev_1_1atan2__func_3_01uint_01_4.html#a86eb842a0331b8d78aaf9d549f7f9e60',1,'cv::cudev::atan2_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d3/d2f/structcv_1_1cudev_1_1atan2__func_3_01ushort_01_4.html#aac55a6e3c6029d3e78c55621ba4da3b3',1,'cv::cudev::atan2_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/df/d91/structcv_1_1cudev_1_1atan__func.html#aaf59131d17cd6f8e0460b27ab2c3a592',1,'cv::cudev::atan_func::operator()()'],['https://docs.opencv.org/4.2.0/d4/d8e/structcv_1_1cudev_1_1atan__func_3_01double_01_4.html#a7a4e8cda92da1627965c13cf5a7e5bd6',1,'cv::cudev::atan_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dc1/structcv_1_1cudev_1_1atan__func_3_01float_01_4.html#a9dd06696f21326f73219a9676da4cadb',1,'cv::cudev::atan_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d4a/structcv_1_1cudev_1_1atan__func_3_01schar_01_4.html#a2ace3f94c175ba447f5ff3491bbc0f4a',1,'cv::cudev::atan_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d20/structcv_1_1cudev_1_1atan__func_3_01short_01_4.html#a94ca8f0722bdd8644dc260d770717c97',1,'cv::cudev::atan_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/dd/dce/structcv_1_1cudev_1_1atan__func_3_01uchar_01_4.html#afc69d55cb3f353d36edb4a009e6a489b',1,'cv::cudev::atan_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/de6/structcv_1_1cudev_1_1atan__func_3_01uint_01_4.html#a1d4d42bb9b4aa669b985bbbcf2279fd7',1,'cv::cudev::atan_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d1/da0/structcv_1_1cudev_1_1atan__func_3_01ushort_01_4.html#a5ec7b0f0f0ec3e89c8647d985de6a508',1,'cv::cudev::atan_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1cudev_1_1atanh__func.html#a7edb319d3025314f194ed524445ecbb4',1,'cv::cudev::atanh_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/d41/structcv_1_1cudev_1_1atanh__func_3_01double_01_4.html#aa8e199a08e43ec0d5171a69d7338d9d2',1,'cv::cudev::atanh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d2d/structcv_1_1cudev_1_1atanh__func_3_01float_01_4.html#a153da89a9a6d590316ad349f95427817',1,'cv::cudev::atanh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd6/structcv_1_1cudev_1_1atanh__func_3_01schar_01_4.html#acc9242ab80f0ab4475bb28138cc36707',1,'cv::cudev::atanh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d3a/structcv_1_1cudev_1_1atanh__func_3_01short_01_4.html#a3bbe7f572ee9bd3a177b840e62d91f7e',1,'cv::cudev::atanh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d90/structcv_1_1cudev_1_1atanh__func_3_01uchar_01_4.html#a1bc8a25394326dca443aafe1dacd79b2',1,'cv::cudev::atanh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/ddc/structcv_1_1cudev_1_1atanh__func_3_01uint_01_4.html#abab90e89b20be773fa2ec8b9c117bdce',1,'cv::cudev::atanh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dd0/structcv_1_1cudev_1_1atanh__func_3_01ushort_01_4.html#a405304579640281e82b10a1b1a7dce8b',1,'cv::cudev::atanh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1detail_1_1BestOf2NearestRangeMatcher.html#a66deb1783f81d32e61e64533aa03e103',1,'cv::detail::BestOf2NearestRangeMatcher::operator()()'],['https://docs.opencv.org/4.2.0/d6/d83/classcv_1_1line__descriptor_1_1BinaryDescriptor.html#aceb00c1f30edf4b763d510e88a2bd0e1',1,'cv::line_descriptor::BinaryDescriptor::operator()()'],['https://docs.opencv.org/4.2.0/d1/d81/structcv_1_1cudev_1_1BinaryNegate.html#a36756888244e5ef22f86fd4c49fc7a15',1,'cv::cudev::BinaryNegate::operator()()'],['https://docs.opencv.org/4.2.0/db/d77/structcv_1_1cudev_1_1BinaryTransformPtr.html#ae37dde0385c22b65a264ab65c21f39b9',1,'cv::cudev::BinaryTransformPtr::operator()()'],['https://docs.opencv.org/4.2.0/dc/da3/structcv_1_1cudev_1_1BinaryTupleAdapter.html#a991d05c3c6bdc3cad44d5c06bdb98a51',1,'cv::cudev::BinaryTupleAdapter::operator()()'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1Binder1st.html#a961f08f309d5aee4e0aeaab104903b80',1,'cv::cudev::Binder1st::operator()()'],['https://docs.opencv.org/4.2.0/d6/db4/structcv_1_1cudev_1_1Binder2nd.html#ad0467cfe7ff80497c4d75dfe802bfc6d',1,'cv::cudev::Binder2nd::operator()()'],['https://docs.opencv.org/4.2.0/d9/de7/structcv_1_1cudev_1_1bit__and.html#af7f2f2bbf763662ba9f6ad6d715325b2',1,'cv::cudev::bit_and::operator()()'],['https://docs.opencv.org/4.2.0/d3/d65/structcv_1_1cudev_1_1bit__lshift.html#a319adce84f53f86c628d35bbbf4a6a8f',1,'cv::cudev::bit_lshift::operator()()'],['https://docs.opencv.org/4.2.0/d0/d8a/structcv_1_1cudev_1_1bit__not.html#a54dd18d632ab34ca40cfa34051c6837b',1,'cv::cudev::bit_not::operator()()'],['https://docs.opencv.org/4.2.0/dd/d1c/structcv_1_1cudev_1_1bit__or.html#a9f4238b0c69f7b11dceade45b5e725e7',1,'cv::cudev::bit_or::operator()()'],['https://docs.opencv.org/4.2.0/d4/d2a/structcv_1_1cudev_1_1bit__rshift.html#ab4777501448c008710af761884857af7',1,'cv::cudev::bit_rshift::operator()()'],['https://docs.opencv.org/4.2.0/df/d44/structcv_1_1cudev_1_1bit__xor.html#aae72022cafd71a432dcd395a79ea93c0',1,'cv::cudev::bit_xor::operator()()'],['https://docs.opencv.org/4.2.0/de/d53/structcv_1_1cudev_1_1BrdBase.html#a9d17dbeddaa46c18fa0fa4e4a9e75db3',1,'cv::cudev::BrdBase::operator()()'],['https://docs.opencv.org/4.2.0/da/dfa/structcv_1_1cudev_1_1BrdConstant.html#a848eeec7df49f12d767c8460e7d571b4',1,'cv::cudev::BrdConstant::operator()()'],['https://docs.opencv.org/4.2.0/dc/d9a/structcv_1_1stereo_1_1CensusKernel.html#af6aaa70f1767009aca371d0a195a897f',1,'cv::stereo::CensusKernel::operator()()'],['https://docs.opencv.org/4.2.0/d4/d5b/classcv_1_1stereo_1_1CombinedDescriptor.html#ab5cf7d0c8c4072e3284fc6d140f8675c',1,'cv::stereo::CombinedDescriptor::operator()()'],['https://docs.opencv.org/4.2.0/d8/d3d/structcv_1_1cudev_1_1CommonAreaInterPtr.html#a59488b025a29244f32bb13b8e88ca9c8',1,'cv::cudev::CommonAreaInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d5/db7/structcv_1_1cudev_1_1ConstantPtr.html#ab9fdee7febaee40d0a8d84dc03e683f6',1,'cv::cudev::ConstantPtr::operator()()'],['https://docs.opencv.org/4.2.0/d6/dfb/structcv_1_1cudev_1_1cos__func.html#a988f8089a8b8d195a2ff3bd00b83d46f',1,'cv::cudev::cos_func::operator()()'],['https://docs.opencv.org/4.2.0/db/d23/structcv_1_1cudev_1_1cos__func_3_01double_01_4.html#aaf9cfdadc2fdf132ce1c6fd1bc4d23c7',1,'cv::cudev::cos_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d7a/structcv_1_1cudev_1_1cos__func_3_01float_01_4.html#aabb752915736cacff3b15eb91a1cc4c5',1,'cv::cudev::cos_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d25/structcv_1_1cudev_1_1cos__func_3_01schar_01_4.html#a1e26eec7e6cf6e3cf0ddfcd4d150f10e',1,'cv::cudev::cos_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d03/structcv_1_1cudev_1_1cos__func_3_01short_01_4.html#a97f88f391e8eccee42251572d6917d39',1,'cv::cudev::cos_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d3d/structcv_1_1cudev_1_1cos__func_3_01uchar_01_4.html#a693d78041e8f0eb86a521d7ea868aaa6',1,'cv::cudev::cos_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/da/dc1/structcv_1_1cudev_1_1cos__func_3_01uint_01_4.html#a2fe66a37f8017659d4528d44361536d8',1,'cv::cudev::cos_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/df/d35/structcv_1_1cudev_1_1cos__func_3_01ushort_01_4.html#ae58914f83f44a50534220d0496c6f134',1,'cv::cudev::cos_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d8a/structcv_1_1cudev_1_1cosh__func.html#a2762fccc8bcb7c73e5029fb2ca79e9b0',1,'cv::cudev::cosh_func::operator()()'],['https://docs.opencv.org/4.2.0/d5/d3a/structcv_1_1cudev_1_1cosh__func_3_01double_01_4.html#a1a46775b2bbfbad92506fb451ee1c79d',1,'cv::cudev::cosh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/db/d8d/structcv_1_1cudev_1_1cosh__func_3_01float_01_4.html#a1ee29ef52dc2cf4be6d5e6270503bea5',1,'cv::cudev::cosh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/df/dd8/structcv_1_1cudev_1_1cosh__func_3_01schar_01_4.html#a7f79b5591445191cb72512e705306d72',1,'cv::cudev::cosh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d8a/structcv_1_1cudev_1_1cosh__func_3_01short_01_4.html#a73e6537c788b836c602d48c0dbf79e38',1,'cv::cudev::cosh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/de/d73/structcv_1_1cudev_1_1cosh__func_3_01uchar_01_4.html#ab4369c5946fe73e32b0eec7f6b77ad75',1,'cv::cudev::cosh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/ddd/structcv_1_1cudev_1_1cosh__func_3_01uint_01_4.html#a43b76700e20129190cc77111c02e53e4',1,'cv::cudev::cosh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd3/structcv_1_1cudev_1_1cosh__func_3_01ushort_01_4.html#a0171124ee451386c0d600734bd840401',1,'cv::cudev::cosh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d3/def/structcv_1_1cudev_1_1CubicInterPtr.html#ab39bee06ee1a2be6a2e38a7d369a716f',1,'cv::cudev::CubicInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#ab5bd6ed0b55f60a2c96b18824f7438dd',1,'cv::CvFeatureEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/db/d35/classcv_1_1CvHaarEvaluator.html#aa58bba803ef918036facf78ca50c403c',1,'cv::CvHaarEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga68c6b644dd17b10637cf74117c44e35e',1,'cv::CvHOGEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/d1/d26/classcv_1_1CvLBPEvaluator.html#a838cd13385f89f2cda2643857d1f34b5',1,'cv::CvLBPEvaluator::operator()()'],['https://docs.opencv.org/4.2.0/d0/d90/structcv_1_1DefaultDeleter_3_01CvCapture_01_4.html#a36b7e1f33f49b098f807f8581b1473a7',1,'cv::DefaultDeleter< CvCapture >::operator()()'],['https://docs.opencv.org/4.2.0/d9/ddf/structcv_1_1DefaultDeleter_3_01CvHaarClassifierCascade_01_4.html#a44656fba99887584e8bc88775dc4888a',1,'cv::DefaultDeleter< CvHaarClassifierCascade >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d37/structcv_1_1DefaultDeleter_3_01CvVideoWriter_01_4.html#a28a310125686255f0149c04ce70ea48e',1,'cv::DefaultDeleter< CvVideoWriter >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d5e/classcv_1_1rgbd_1_1DepthCleaner.html#ab006210fdd363a9b0c42f5c11433398d',1,'cv::rgbd::DepthCleaner::operator()()'],['https://docs.opencv.org/4.2.0/df/d8b/structcv_1_1cudev_1_1DerivXPtr.html#af9c609af8dbdb0ce6db7e5a9020ec9c0',1,'cv::cudev::DerivXPtr::operator()()'],['https://docs.opencv.org/4.2.0/dc/d51/structcv_1_1cudev_1_1DerivYPtr.html#a1ae2a1e12cc4916fe99f0330eaeb61fd',1,'cv::cudev::DerivYPtr::operator()()'],['https://docs.opencv.org/4.2.0/d3/d97/structcv_1_1cudev_1_1direction__func.html#a2155dbec5fdc65714b561ce94620691a',1,'cv::cudev::direction_func::operator()()'],['https://docs.opencv.org/4.2.0/de/d2a/structcv_1_1cudev_1_1divides.html#a1cd06b89048d107490992a1531fd2a34',1,'cv::cudev::divides::operator()()'],['https://docs.opencv.org/4.2.0/d2/dfd/structcv_1_1cudev_1_1equal__to.html#aa8931c7ed8ea7e2604c38b704b9dfb82',1,'cv::cudev::equal_to::operator()()'],['https://docs.opencv.org/4.2.0/df/d15/classcv_1_1detail_1_1Estimator.html#a0924447fc99df3360b6f005a7c0aa437',1,'cv::detail::Estimator::operator()()'],['https://docs.opencv.org/4.2.0/dc/d8b/structcv_1_1cudev_1_1exp10__func.html#a071ded47294be622de0150f258efd229',1,'cv::cudev::exp10_func::operator()()'],['https://docs.opencv.org/4.2.0/d0/d66/structcv_1_1cudev_1_1exp10__func_3_01double_01_4.html#a626097f0778f1a40babc5517ddb8153a',1,'cv::cudev::exp10_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d78/structcv_1_1cudev_1_1exp10__func_3_01float_01_4.html#afa1c84f89716f836ef03262a078fcdab',1,'cv::cudev::exp10_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dde/structcv_1_1cudev_1_1exp10__func_3_01schar_01_4.html#af0f0403c9cd63a22d8f38071b47485ab',1,'cv::cudev::exp10_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1exp10__func_3_01short_01_4.html#a3ec1f45ae0cdb736f23b16925812d758',1,'cv::cudev::exp10_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d1/ddd/structcv_1_1cudev_1_1exp10__func_3_01uchar_01_4.html#aaccfbfbcf2c5636b4ebcffb40b744427',1,'cv::cudev::exp10_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/dc3/structcv_1_1cudev_1_1exp10__func_3_01uint_01_4.html#aef6b50b90e3757e58b6cd47fd83eaeff',1,'cv::cudev::exp10_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d4/da4/structcv_1_1cudev_1_1exp10__func_3_01ushort_01_4.html#a2432a747a7d34541301142a46460a7e2',1,'cv::cudev::exp10_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/dd9/structcv_1_1cudev_1_1exp2__func.html#a7a72f8aa55099dd88aa51a6e2bf51730',1,'cv::cudev::exp2_func::operator()()'],['https://docs.opencv.org/4.2.0/d8/d9b/structcv_1_1cudev_1_1exp2__func_3_01double_01_4.html#aa8b8ebaa15b369605febaf2943a48534',1,'cv::cudev::exp2_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dc7/structcv_1_1cudev_1_1exp2__func_3_01float_01_4.html#a76a28168041a40040a59dbe5fcf80ede',1,'cv::cudev::exp2_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/de/da5/structcv_1_1cudev_1_1exp2__func_3_01schar_01_4.html#ab6cd4172be5a97a114e658ee7d8e8d94',1,'cv::cudev::exp2_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/da/d29/structcv_1_1cudev_1_1exp2__func_3_01short_01_4.html#a802f2e62fad66e331f08ed2d50ae420f',1,'cv::cudev::exp2_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d8b/structcv_1_1cudev_1_1exp2__func_3_01uchar_01_4.html#ad1357ddfd7831d00bf1716a740a10b7e',1,'cv::cudev::exp2_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/dc/dd4/structcv_1_1cudev_1_1exp2__func_3_01uint_01_4.html#afba60094be1fee3c426c31fe0c028aea',1,'cv::cudev::exp2_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d30/structcv_1_1cudev_1_1exp2__func_3_01ushort_01_4.html#acd9f9bdf9f2f21c3e4ddda350e62026c',1,'cv::cudev::exp2_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d73/structcv_1_1cudev_1_1exp__func.html#ab52d8176579e6d655d820a20360dc305',1,'cv::cudev::exp_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/db1/structcv_1_1cudev_1_1exp__func_3_01double_01_4.html#ad391b31dd35af417fe08dc8761676b1d',1,'cv::cudev::exp_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/df/dba/structcv_1_1cudev_1_1exp__func_3_01float_01_4.html#adc085ebcc030437fec9cc33766e62b45',1,'cv::cudev::exp_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d33/structcv_1_1cudev_1_1exp__func_3_01schar_01_4.html#ad3a33474b50895c9ea0de63bcc01bd31',1,'cv::cudev::exp_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d67/structcv_1_1cudev_1_1exp__func_3_01short_01_4.html#a537df0eeb7a971b7196baf6b1fbe8b46',1,'cv::cudev::exp_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d9/de4/structcv_1_1cudev_1_1exp__func_3_01uchar_01_4.html#aba3778efd452fe016b2551ae25a9e0bd',1,'cv::cudev::exp_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d3/d6c/structcv_1_1cudev_1_1exp__func_3_01uint_01_4.html#ab1ca81dfae2fa4613035d53d71337b2e',1,'cv::cudev::exp_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dde/structcv_1_1cudev_1_1exp__func_3_01ushort_01_4.html#a07d2ad1cb4b3aa588eb4ffc44a18cef8',1,'cv::cudev::exp_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/df/db2/classcv_1_1cuda_1_1FastOpticalFlowBM.html#ac149a65983f02fa91a5a7a53eb232cf2',1,'cv::cuda::FastOpticalFlowBM::operator()()'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a5d5793f2f71bae1cb72acc3e95d069df',1,'cv::detail::FeaturesMatcher::operator()(const ImageFeatures &features1, const ImageFeatures &features2, MatchesInfo &matches_info)'],['https://docs.opencv.org/4.2.0/da/d87/classcv_1_1detail_1_1FeaturesMatcher.html#a2df19558a646700d9543841cafae4bc2',1,'cv::detail::FeaturesMatcher::operator()(const std::vector< ImageFeatures > &features, std::vector< MatchesInfo > &pairwise_matches, const cv::UMat &mask=cv::UMat())'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ad2ed48a66be94fae14bc3a2a08ea8e95',1,'cv::GCompiled::operator()(GRunArgs &&ins, GRunArgsP &&outs)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a8ada1c617461a8b366b997be5c438d4a',1,'cv::GCompiled::operator()(cv::Mat in, cv::Mat &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a68bcf146b1479be128ee4bb39035fc43',1,'cv::GCompiled::operator()(cv::Mat in, cv::Scalar &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#a7878a8cf7a6e5f5542777c8e1b5c977a',1,'cv::GCompiled::operator()(cv::Mat in1, cv::Mat in2, cv::Mat &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#ac7ea0e242325db157f9dc95cf2c47845',1,'cv::GCompiled::operator()(cv::Mat in1, cv::Mat in2, cv::Scalar &out)'],['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#aa4751e20cd8fa27947b073366d3c130c',1,'cv::GCompiled::operator()(const std::vector< cv::Mat > &ins, const std::vector< cv::Mat > &outs)'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#a8a2d9c2741c247165e1778a35eeedec7',1,'cv::cudev::GlobPtr::operator()(int y, int x)'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1GlobPtr.html#a630b28b0982df38fa4a8370df54c8876',1,'cv::cudev::GlobPtr::operator()(int y, int x) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a2b3c25e36b0f82ca8f9f74b6ae68c41d',1,'cv::cuda::GpuMat::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#a217e27e7051bed168c34ba767915cc63',1,'cv::cuda::GpuMat::operator()(Rect roi) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#aa1ccd7742a80a4f084c78f1d61601073',1,'cv::cudev::GpuMat_::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a5770b11d962d14d542b915f81441ccb4',1,'cv::cudev::GpuMat_::operator()(Rect roi) const'],['https://docs.opencv.org/4.2.0/d9/d1c/structcv_1_1cudev_1_1greater.html#a094203d3b37c3c215eac4c0250577dd3',1,'cv::cudev::greater::operator()()'],['https://docs.opencv.org/4.2.0/dd/d08/structcv_1_1cudev_1_1greater__equal.html#af19f72ea85d3d1fbff57c2cbe0cbb05e',1,'cv::cudev::greater_equal::operator()()'],['https://docs.opencv.org/4.2.0/d3/d59/structcv_1_1Hamming.html#a3d6ec47bfdc0d89f191428ccbfe00823',1,'cv::Hamming::operator()()'],['https://docs.opencv.org/4.2.0/d3/d10/structstd_1_1hash_3_01cv_1_1gapi_1_1GBackend_01_4.html#a5064b9ea589368a0f1814598cfcb67c8',1,'std::hash< cv::gapi::GBackend >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d99/structstd_1_1hash_3_01cv_1_1GShape_01_4.html#aabcf77cfe57beafe3afffb118967829a',1,'std::hash< cv::GShape >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d3e/structcv_1_1cudev_1_1hypot__func.html#a2f42ede8772f0144017fbfc07486947d',1,'cv::cudev::hypot_func::operator()()'],['https://docs.opencv.org/4.2.0/d6/d05/structcv_1_1cudev_1_1hypot__func_3_01double_01_4.html#ac8bf27e184911fc704e88916c649111c',1,'cv::cudev::hypot_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d37/structcv_1_1cudev_1_1hypot__func_3_01float_01_4.html#a66cf4ee063a301dc96ee60077be2294f',1,'cv::cudev::hypot_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/df/dbd/structcv_1_1cudev_1_1hypot__func_3_01schar_01_4.html#aaf99e66892b49d09d373efd1f40fa989',1,'cv::cudev::hypot_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d0b/structcv_1_1cudev_1_1hypot__func_3_01short_01_4.html#a09105d3f2332f484875c304fba5bcc0e',1,'cv::cudev::hypot_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/db0/structcv_1_1cudev_1_1hypot__func_3_01uchar_01_4.html#aa16959b94a6a1da0516f20fefa457cca',1,'cv::cudev::hypot_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dad/structcv_1_1cudev_1_1hypot__func_3_01uint_01_4.html#a6f4a739bd0d21bd64e163cfb091fc3e2',1,'cv::cudev::hypot_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d26/structcv_1_1cudev_1_1hypot__func_3_01ushort_01_4.html#a32ad689516093e2d048d47e1775e71bf',1,'cv::cudev::hypot_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/df/d22/structcv_1_1cudev_1_1identity.html#ae8e53f80a081edd0156421f7e502674a',1,'cv::cudev::identity::operator()()'],['https://docs.opencv.org/4.2.0/d3/de3/structcv_1_1cudev_1_1IntegerAreaInterPtr.html#ab439f549a54e7fb4d077d51e26fc1e81',1,'cv::cudev::IntegerAreaInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1L1.html#a6e1989c64affb81cd157f49f9b8b93b0',1,'cv::L1::operator()()'],['https://docs.opencv.org/4.2.0/dc/daa/structcv_1_1L2.html#a1bd9f1b3a846126410d188c72645c25d',1,'cv::L2::operator()()'],['https://docs.opencv.org/4.2.0/d0/de6/structcv_1_1cudev_1_1LaplacianPtr_3_011_00_01SrcPtr_01_4.html#a378fe7b55d2ee57979706e7cbd3a3dde',1,'cv::cudev::LaplacianPtr< 1, SrcPtr >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d89/structcv_1_1cudev_1_1LaplacianPtr_3_013_00_01SrcPtr_01_4.html#af02fec60f0690261a54910e6e1ca5542',1,'cv::cudev::LaplacianPtr< 3, SrcPtr >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d04/structcv_1_1cudev_1_1less.html#aef70d1d8dee6dca98128735c2a60f486',1,'cv::cudev::less::operator()()'],['https://docs.opencv.org/4.2.0/d1/d03/structcv_1_1cudev_1_1less__equal.html#a35cab8e57e6e215821e61ed7d116045e',1,'cv::cudev::less_equal::operator()()'],['https://docs.opencv.org/4.2.0/d7/d8a/structcv_1_1cudev_1_1LinearInterPtr.html#a354dbbfbda853a6497da10ac614732ea',1,'cv::cudev::LinearInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d8/da8/structcv_1_1cudev_1_1log10__func.html#a8ed0d87633e88b1e5ec26ccb62017a84',1,'cv::cudev::log10_func::operator()()'],['https://docs.opencv.org/4.2.0/dc/d32/structcv_1_1cudev_1_1log10__func_3_01double_01_4.html#a55aa0560ae5a0fc01487540ff1658e87',1,'cv::cudev::log10_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d42/structcv_1_1cudev_1_1log10__func_3_01float_01_4.html#ae7011f3b9f7529c765c6d4433e93d9bc',1,'cv::cudev::log10_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d4b/structcv_1_1cudev_1_1log10__func_3_01schar_01_4.html#ab04065a7b741671ea7050e5367a94362',1,'cv::cudev::log10_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d00/structcv_1_1cudev_1_1log10__func_3_01short_01_4.html#a4490ba24cdd88c8c1708830583aef024',1,'cv::cudev::log10_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/dd/dcc/structcv_1_1cudev_1_1log10__func_3_01uchar_01_4.html#a4f9937403d93a32fe7d0e9b18831821c',1,'cv::cudev::log10_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/df/d6e/structcv_1_1cudev_1_1log10__func_3_01uint_01_4.html#af462996a0b52e703042273d4533983b7',1,'cv::cudev::log10_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d0/df1/structcv_1_1cudev_1_1log10__func_3_01ushort_01_4.html#aef130449d3276fedd53036bbaafe6828',1,'cv::cudev::log10_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d23/structcv_1_1cudev_1_1log2__func.html#aba0f8b5ead7e4fb3e6f8c6f2cbcddca9',1,'cv::cudev::log2_func::operator()()'],['https://docs.opencv.org/4.2.0/dc/d17/structcv_1_1cudev_1_1log2__func_3_01double_01_4.html#ae825f360d7a8c1c2976ec16a52afcbe3',1,'cv::cudev::log2_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/db/dba/structcv_1_1cudev_1_1log2__func_3_01float_01_4.html#afdfb43df5d0d168e65bfa795f0654034',1,'cv::cudev::log2_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1log2__func_3_01schar_01_4.html#aeb64ee83eecff169547ebf72ff37f2f4',1,'cv::cudev::log2_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d0b/structcv_1_1cudev_1_1log2__func_3_01short_01_4.html#a7dc4e28152086625533614481d4c436f',1,'cv::cudev::log2_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d41/structcv_1_1cudev_1_1log2__func_3_01uchar_01_4.html#a169dfefed3bcccacbf67bdb20f119f5e',1,'cv::cudev::log2_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/df/d69/structcv_1_1cudev_1_1log2__func_3_01uint_01_4.html#ae44865085e382670f17536552d9f8d1a',1,'cv::cudev::log2_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d0/dda/structcv_1_1cudev_1_1log2__func_3_01ushort_01_4.html#afe1f535584f0fcaa41dd4aac88871bd9',1,'cv::cudev::log2_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d41/structcv_1_1cudev_1_1log__func.html#a943bb3c0839bc97fc724689bb0fe8651',1,'cv::cudev::log_func::operator()()'],['https://docs.opencv.org/4.2.0/dd/dad/structcv_1_1cudev_1_1log__func_3_01double_01_4.html#ad41e4d4a49cba0a2f14ce7b44860f102',1,'cv::cudev::log_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d85/structcv_1_1cudev_1_1log__func_3_01float_01_4.html#ad9d324de3522e32adda4eed82c24669b',1,'cv::cudev::log_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d2/de1/structcv_1_1cudev_1_1log__func_3_01schar_01_4.html#a299f70fa2dc5d67e51165035904d9eb8',1,'cv::cudev::log_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d19/structcv_1_1cudev_1_1log__func_3_01short_01_4.html#a77a4daf23da2dd3f99aa6559106101b4',1,'cv::cudev::log_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d3/db5/structcv_1_1cudev_1_1log__func_3_01uchar_01_4.html#a877322f5cbcc6845276f7096a39a59d2',1,'cv::cudev::log_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d0/dee/structcv_1_1cudev_1_1log__func_3_01uint_01_4.html#a6d1fe6935269490408f023d6dbc82d80',1,'cv::cudev::log_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d0c/structcv_1_1cudev_1_1log__func_3_01ushort_01_4.html#a25d4a879c093d9c65d9ae24021a599c9',1,'cv::cudev::log_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1cudev_1_1logical__and.html#a6a80f03acb116ed9e5f3f533dd8cf1a6',1,'cv::cudev::logical_and::operator()()'],['https://docs.opencv.org/4.2.0/d4/d01/structcv_1_1cudev_1_1logical__not.html#a5d6fd2eb21769c8ab859395f9aaad133',1,'cv::cudev::logical_not::operator()()'],['https://docs.opencv.org/4.2.0/d3/db2/structcv_1_1cudev_1_1logical__or.html#a682a316f3d1c904a8b03f4132a432955',1,'cv::cudev::logical_or::operator()()'],['https://docs.opencv.org/4.2.0/df/daa/structcv_1_1cudev_1_1LutPtr.html#a45ddaa9b235af7db44bb4cee9fc02a04',1,'cv::cudev::LutPtr::operator()()'],['https://docs.opencv.org/4.2.0/d1/deb/structcv_1_1cudev_1_1magnitude__func.html#a89c8b5fbcd6dfe676ac11e6e4b339287',1,'cv::cudev::magnitude_func::operator()()'],['https://docs.opencv.org/4.2.0/d3/da4/structcv_1_1cudev_1_1magnitude__sqr__func.html#aaaab7e87a8f39b310caf6f0e20a623c3',1,'cv::cudev::magnitude_sqr_func::operator()()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#ad543b6bd296ae1247032c750af4718e1',1,'cv::Mat::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a4272fce43d7405603fbb5e5f52580e57',1,'cv::Mat::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aee56475f834069b1fad3877c0747aaeb',1,'cv::Mat::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa9bf4fcbb6e854a6db7b7254a205fac9',1,'cv::Mat::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#aafddf1814d6868d7c67220cf5726f932',1,'cv::gapi::own::Mat::operator()()'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'cv::Mat_::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'cv::Mat_::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'cv::Mat_::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'cv::Mat_::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'cv::Mat_::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'cv::Mat_::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'cv::Mat_::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'cv::Mat_::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'cv::Mat_::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'cv::Mat_::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'cv::Mat_::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'cv::Mat_::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'cv::Mat_::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'cv::Mat_::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'cv::Mat_::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'cv::Mat_::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< double >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< double >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< double >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< double >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< double >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< double >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< double >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< double >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< double >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< double >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< double >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< double >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< double >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< double >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< double >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< double >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< float >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< float >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< float >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< float >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< float >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< float >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< float >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< float >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< float >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< float >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< float >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< float >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< float >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< float >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< float >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< float >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< uchar >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< uchar >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< uchar >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< uchar >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< uchar >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< uchar >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< uchar >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< uchar >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< uchar >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< uchar >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< uchar >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< uchar >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< uchar >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< uchar >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< uchar >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< uchar >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afc130a2047ed636c800a676a3fef6702',1,'Mat_< unsigned char >::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aae6a61bc65e081d2740b7994b514fbf1',1,'Mat_< unsigned char >::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#acdffbb4fec8fe32175218327163a857d',1,'Mat_< unsigned char >::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#aa66314a65ff3418a71f4865f9e93f141',1,'Mat_< unsigned char >::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a27b635a438a7426e6baf65d8603a5648',1,'Mat_< unsigned char >::operator()(const int *idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a65e801cf3ac4d9bf205517aa74bfb2b3',1,'Mat_< unsigned char >::operator()(const int *idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a26a958253fef6c10280bdb10c9569fa7',1,'Mat_< unsigned char >::operator()(const Vec< int, n > &idx)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a9bddf87eee70904f02b9755e222d85ec',1,'Mat_< unsigned char >::operator()(const Vec< int, n > &idx) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a34a3da91f39f4229e45907284abb0608',1,'Mat_< unsigned char >::operator()(int idx0)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a370f9635c2ec8001ea69e5f1182994d2',1,'Mat_< unsigned char >::operator()(int idx0) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af06d3170cbd180f48150241012610bb8',1,'Mat_< unsigned char >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1ba0dbb9955d3588470dec425a4ce293',1,'Mat_< unsigned char >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a1dbf43a2d4aa6e6a63612bc53095efa1',1,'Mat_< unsigned char >::operator()(int idx0, int idx1, int idx2)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a4170ca2377644a2de4822f2c5823f91e',1,'Mat_< unsigned char >::operator()(int idx0, int idx1, int idx2) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#af86af7b2cf8af15fe6a07a316c231d29',1,'Mat_< unsigned char >::operator()(Point pt)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a41c412bb192a1535fd7893b5a0cd6cd0',1,'Mat_< unsigned char >::operator()(Point pt) const'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6bceaa05f2fea4c73bc95f4b9e7d09bf',1,'cv::MatExpr::operator()(const Range &rowRange, const Range &colRange) const'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae3d4aa0cf6b40c5829c6377a54101068',1,'cv::MatExpr::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#abdc35c3d1d636243a9fa4b7e3a4810fe',1,'cv::MatSize::operator()()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'cv::Matx::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'cv::Matx::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'cv::Matx::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'cv::Matx::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< _Tp, cn, 1 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< _Tp, cn, 1 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< _Tp, cn, 1 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< _Tp, cn, 1 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 1, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 1, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 1, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 1, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 2, 2 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 2, 2 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 2, 2 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 2, 2 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 2, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 2, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 2, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 2, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 3, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 3, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 3, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 3, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 3, 4 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 3, 4 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 3, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 3, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, 4, 4 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, 4, 4 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, 4, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, 4, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< double, cn, 1 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< double, cn, 1 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< double, cn, 1 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< double, cn, 1 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float, 2, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float, 2, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float, 2, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float, 2, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float, 3, 3 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float, 3, 3 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float, 3, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float, 3, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float, cn, 1 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float, cn, 1 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float, cn, 1 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float, cn, 1 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a755a3ab99c555fde38f41746c68d6055',1,'Matx< float_type, 4, 4 >::operator()(int row, int col) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a42afe924b158e8777b5b39810b5a1825',1,'Matx< float_type, 4, 4 >::operator()(int row, int col)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a605f3bd68541387226627fd6a9f706bb',1,'Matx< float_type, 4, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a686d4530a3baaf2640520c8aa9222439',1,'Matx< float_type, 4, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d4/d31/structcv_1_1cudev_1_1maximum.html#a23944a3a9a900d9121217a9b2bd7cf1e',1,'cv::cudev::maximum::operator()()'],['https://docs.opencv.org/4.2.0/dc/d65/structcv_1_1cudev_1_1maximum_3_01double_01_4.html#aaa3ea51b43edde4613cd12bfdcb9d760',1,'cv::cudev::maximum< double >::operator()()'],['https://docs.opencv.org/4.2.0/d4/d1e/structcv_1_1cudev_1_1maximum_3_01float_01_4.html#a38c973c79baab206514a0b3108633add',1,'cv::cudev::maximum< float >::operator()()'],['https://docs.opencv.org/4.2.0/df/df2/structcv_1_1cudev_1_1maximum_3_01schar_01_4.html#a5ec2a8da9db4e38703a428def99c26d2',1,'cv::cudev::maximum< schar >::operator()()'],['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1maximum_3_01short_01_4.html#a9d79fb3032785722e26b00a37995a045',1,'cv::cudev::maximum< short >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d84/structcv_1_1cudev_1_1maximum_3_01uchar_01_4.html#a98a3d896491e04c7d9977eed91f2362f',1,'cv::cudev::maximum< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dfa/structcv_1_1cudev_1_1maximum_3_01uint_01_4.html#a6f78b59b8fde2766a8827de3f01d8db8',1,'cv::cudev::maximum< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d0/dac/structcv_1_1cudev_1_1maximum_3_01ushort_01_4.html#a5bda4bdb72d47bcb77ff15390922e450',1,'cv::cudev::maximum< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d03/structcv_1_1stereo_1_1MCTKernel.html#a8c678dd239c97b2fd12611f1363900f0',1,'cv::stereo::MCTKernel::operator()()'],['https://docs.opencv.org/4.2.0/de/d9b/classcv_1_1stereo_1_1MeanKernelIntegralImage.html#a806da8fa9a91098398f78c36d79e3991',1,'cv::stereo::MeanKernelIntegralImage::operator()()'],['https://docs.opencv.org/4.2.0/d5/dc9/structcv_1_1cudev_1_1minimum.html#acdf2ef08e5d48af75d2122e8671aea68',1,'cv::cudev::minimum::operator()()'],['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1minimum_3_01double_01_4.html#a48a0b885006be6a0fa8e9d11c54d4e5b',1,'cv::cudev::minimum< double >::operator()()'],['https://docs.opencv.org/4.2.0/d1/d9d/structcv_1_1cudev_1_1minimum_3_01float_01_4.html#a8fbc1f931bb9d8d68e623e7bc561382a',1,'cv::cudev::minimum< float >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d75/structcv_1_1cudev_1_1minimum_3_01schar_01_4.html#a8f420b811fad523efc6aa53007d6d966',1,'cv::cudev::minimum< schar >::operator()()'],['https://docs.opencv.org/4.2.0/db/d5b/structcv_1_1cudev_1_1minimum_3_01short_01_4.html#af73ef8474d4331959f890e839e0c6253',1,'cv::cudev::minimum< short >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d48/structcv_1_1cudev_1_1minimum_3_01uchar_01_4.html#a7deb2150864ae4502dc4441bc12d4336',1,'cv::cudev::minimum< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1cudev_1_1minimum_3_01uint_01_4.html#adf25e14f21fe7eb1537a294d819d79d1',1,'cv::cudev::minimum< uint >::operator()()'],['https://docs.opencv.org/4.2.0/de/dfa/structcv_1_1cudev_1_1minimum_3_01ushort_01_4.html#ac33cd62d0c0ebbeed517eab9d577517d',1,'cv::cudev::minimum< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/da/df1/structcv_1_1cudev_1_1minus.html#aa2c21f87c2bc60ae0d5c5d7770b023c8',1,'cv::cudev::minus::operator()()'],['https://docs.opencv.org/4.2.0/dc/dfc/structcv_1_1stereo_1_1ModifiedCsCensus.html#a33ef2dffc9591c30f8fee5f6b5ae7e04',1,'cv::stereo::ModifiedCsCensus::operator()()'],['https://docs.opencv.org/4.2.0/d7/d7f/structcv_1_1cudev_1_1modulus.html#adbb9a4b035592f32258f013f378d50dd',1,'cv::cudev::modulus::operator()()'],['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1cudev_1_1multiplies.html#ae098f5637977e29132fbb3a8607921a9',1,'cv::cudev::multiplies::operator()()'],['https://docs.opencv.org/4.2.0/dd/dbc/structcv_1_1stereo_1_1MVKernel.html#a2e082e01e62b186decf5a1f58884dd80',1,'cv::stereo::MVKernel::operator()()'],['https://docs.opencv.org/4.2.0/d0/df5/structcv_1_1cudev_1_1NearestInterPtr.html#afa902e3d702382f0a68112d8342b24f3',1,'cv::cudev::NearestInterPtr::operator()()'],['https://docs.opencv.org/4.2.0/d9/d77/structcv_1_1cudev_1_1negate.html#a9729e5847cd4d6004ac225e156cdbe86',1,'cv::cudev::negate::operator()()'],['https://docs.opencv.org/4.2.0/df/d9f/structcv_1_1cudev_1_1not__equal__to.html#ac80d0c172252fb5bc65ed4671113ea23',1,'cv::cudev::not_equal_to::operator()()'],['https://docs.opencv.org/4.2.0/d2/d74/classcv_1_1ParallelLoopBody.html#a90285bcea9c56345622bfd6817d41b1f',1,'cv::ParallelLoopBody::operator()()'],['https://docs.opencv.org/4.2.0/d3/d78/classcv_1_1ParallelLoopBodyLambdaWrapper.html#a6b7b341ff554b63cda3e71f4481a38d7',1,'cv::ParallelLoopBodyLambdaWrapper::operator()()'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#a26e76331a68988144a403649c6b8af5c',1,'cv::PCA::operator()(InputArray data, InputArray mean, int flags, int maxComponents=0)'],['https://docs.opencv.org/4.2.0/d3/d8d/classcv_1_1PCA.html#aff68797b34e6edb162b0f5d1819b2e9f',1,'cv::PCA::operator()(InputArray data, InputArray mean, int flags, double retainedVariance)'],['https://docs.opencv.org/4.2.0/df/d20/structcv_1_1cudev_1_1PerspectiveMapPtr.html#aa9a16f8b9d196cbac5122f2bea12fada',1,'cv::cudev::PerspectiveMapPtr::operator()()'],['https://docs.opencv.org/4.2.0/d4/dd0/structcv_1_1cudev_1_1plus.html#a149c533def9926ab9d6e6ca57257068a',1,'cv::cudev::plus::operator()()'],['https://docs.opencv.org/4.2.0/da/dda/structcv_1_1cudev_1_1pow__func.html#a4fe691da815bb8f351f6816e4ad7311a',1,'cv::cudev::pow_func::operator()()'],['https://docs.opencv.org/4.2.0/d2/deb/structcv_1_1cudev_1_1pow__func_3_01double_01_4.html#ac79d0918dd34db9fb7703a573ae3e83c',1,'cv::cudev::pow_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d3/dea/structcv_1_1cudev_1_1project1st.html#ab10af9ecf413990340288b5d49d8314e',1,'cv::cudev::project1st::operator()()'],['https://docs.opencv.org/4.2.0/d2/dd5/structcv_1_1cudev_1_1project2nd.html#a33823b1e54a8d5b4085163083b7a460d',1,'cv::cudev::project2nd::operator()()'],['https://docs.opencv.org/4.2.0/dc/d09/structcv_1_1cudev_1_1RemapPtr1.html#a83f91a025a0f41d3a0b528478a3cb532',1,'cv::cudev::RemapPtr1::operator()()'],['https://docs.opencv.org/4.2.0/d1/d32/structcv_1_1cudev_1_1RemapPtr2.html#ab539f18b7ebc19adf055670324c2bc09',1,'cv::cudev::RemapPtr2::operator()()'],['https://docs.opencv.org/4.2.0/d5/db1/structcv_1_1cudev_1_1ResizePtr.html#aa890dd8d7b5108f77108b0f3dbf2d87f',1,'cv::cudev::ResizePtr::operator()()'],['https://docs.opencv.org/4.2.0/d1/d5b/classcv_1_1rgbd_1_1RgbdNormals.html#a48c33f26d8662a1b3becfda60292ac5c',1,'cv::rgbd::RgbdNormals::operator()()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a1a638d0a9367b86bc56b98b9e550b9dc',1,'cv::rgbd::RgbdPlane::operator()(InputArray points3d, InputArray normals, OutputArray mask, OutputArray plane_coefficients)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#a8c519cbffd2b296330b1ef5081530968',1,'cv::rgbd::RgbdPlane::operator()(InputArray points3d, OutputArray mask, OutputArray plane_coefficients)'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a16ca31c8e2ec0990df323b442ab09e4f',1,'cv::RNG::operator()()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#ac0112dc300696b1fc7998d37f15dd733',1,'cv::RNG::operator()(unsigned N)'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#a5102b5f43fc7c2997f2d2bc6b693e0b4',1,'cv::RNG_MT19937::operator()(unsigned N)'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1RNG__MT19937.html#aa52601c233cda79131052299a88ad9c2',1,'cv::RNG_MT19937::operator()()'],['https://docs.opencv.org/4.2.0/d3/d11/structcv_1_1cudev_1_1saturate__cast__fp16__func_3_01float_00_01short_01_4.html#a535ca2a5e7cf42d0da2d17fed04daf16',1,'cv::cudev::saturate_cast_fp16_func< float, short >::operator()()'],['https://docs.opencv.org/4.2.0/dc/dc5/structcv_1_1cudev_1_1saturate__cast__fp16__func_3_01short_00_01float_01_4.html#aadd03bfafa293e9fd11986416a8df232',1,'cv::cudev::saturate_cast_fp16_func< short, float >::operator()()'],['https://docs.opencv.org/4.2.0/dc/d99/structcv_1_1cudev_1_1saturate__cast__func.html#addfef20cf8679f6924202369963bd203',1,'cv::cudev::saturate_cast_func::operator()()'],['https://docs.opencv.org/4.2.0/d7/d71/structcv_1_1cudev_1_1ScharrXPtr.html#ad7c3ca0e1936de91a4da451b12e05461',1,'cv::cudev::ScharrXPtr::operator()()'],['https://docs.opencv.org/4.2.0/d0/d70/structcv_1_1cudev_1_1ScharrYPtr.html#a0d7970b76e5d9f21a0681ca5d794e703',1,'cv::cudev::ScharrYPtr::operator()()'],['https://docs.opencv.org/4.2.0/d1/d65/classcv_1_1SimilarRects.html#a7e70f1c43c4bf8c75851211fb50b265a',1,'cv::SimilarRects::operator()()'],['https://docs.opencv.org/4.2.0/d1/d05/structcv_1_1cudev_1_1sin__func.html#a81bbace4665b94419c862d3dcccdc280',1,'cv::cudev::sin_func::operator()()'],['https://docs.opencv.org/4.2.0/d8/d1c/structcv_1_1cudev_1_1sin__func_3_01double_01_4.html#a8b60b51b51637af0504911dc4d98e2b9',1,'cv::cudev::sin_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d2b/structcv_1_1cudev_1_1sin__func_3_01float_01_4.html#af6ea0d2d4b951bffc9a716a2265c29c9',1,'cv::cudev::sin_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d1b/structcv_1_1cudev_1_1sin__func_3_01schar_01_4.html#a78e9a2b21c9467947f65a9d27036c39f',1,'cv::cudev::sin_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d6f/structcv_1_1cudev_1_1sin__func_3_01short_01_4.html#a8c9bfa6683708b41101edd0290af9fcd',1,'cv::cudev::sin_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/dfd/structcv_1_1cudev_1_1sin__func_3_01uchar_01_4.html#a73cc54b71202279bf8805e0c7f0ab847',1,'cv::cudev::sin_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d5/dbd/structcv_1_1cudev_1_1sin__func_3_01uint_01_4.html#a4511fade1bcfc1f7545c8c8c8c4f3b97',1,'cv::cudev::sin_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d22/structcv_1_1cudev_1_1sin__func_3_01ushort_01_4.html#a0a9f7a66d2a283b05e08ac48947d77f7',1,'cv::cudev::sin_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#a35f754723c723f5ac9ae9c6ae5ddf27d',1,'cv::cudev::SingleMaskChannels::operator()()'],['https://docs.opencv.org/4.2.0/d8/da0/structcv_1_1cudev_1_1sinh__func.html#aa12abb185d04fd4e0df2c97af973366b',1,'cv::cudev::sinh_func::operator()()'],['https://docs.opencv.org/4.2.0/db/dde/structcv_1_1cudev_1_1sinh__func_3_01double_01_4.html#ae0418acd67e1ea0a541a315623bf14fa',1,'cv::cudev::sinh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d3/df1/structcv_1_1cudev_1_1sinh__func_3_01float_01_4.html#a064843f9badf0ed3155b4231bf2ca95c',1,'cv::cudev::sinh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/de/df6/structcv_1_1cudev_1_1sinh__func_3_01schar_01_4.html#a6f95259b1094b0b7bbc5bdb47cafbfad',1,'cv::cudev::sinh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/da/d3e/structcv_1_1cudev_1_1sinh__func_3_01short_01_4.html#a01703492193b054aece7b2d8f2b11357',1,'cv::cudev::sinh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d4/dd2/structcv_1_1cudev_1_1sinh__func_3_01uchar_01_4.html#ae09891519bc4df762a12bedbcc1e41c3',1,'cv::cudev::sinh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/de/d13/structcv_1_1cudev_1_1sinh__func_3_01uint_01_4.html#a0f28cf3217ef7ae5e6be21ee888a0d2d',1,'cv::cudev::sinh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d38/structcv_1_1cudev_1_1sinh__func_3_01ushort_01_4.html#a6667d95cc7c1a83c4c9518a7848ab83d',1,'cv::cudev::sinh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html#a7a6c92810b7489377eb91727182b0e60',1,'cv::SL2::operator()()'],['https://docs.opencv.org/4.2.0/de/dc8/structcv_1_1cudev_1_1SobelXPtr.html#a50ddaa92c615685b26263653013fffc4',1,'cv::cudev::SobelXPtr::operator()()'],['https://docs.opencv.org/4.2.0/d0/da6/structcv_1_1cudev_1_1SobelYPtr.html#a96976834e33e5c4735361a8c62b7e68f',1,'cv::cudev::SobelYPtr::operator()()'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ad7c0f0164b060df2179b3e9f1d1566a8',1,'cv::SparseMat_::operator()(int i0, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a89b99bb281a9747b54e94be670f6a010',1,'cv::SparseMat_::operator()(int i0, int i1, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ab4ffea87933a1bffcadd0db260c36846',1,'cv::SparseMat_::operator()(int i0, int i1, int i2, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#ae68f3e59954cc03297b2d0e6e8ba9014',1,'cv::SparseMat_::operator()(const int *idx, size_t *hashval=0) const'],['https://docs.opencv.org/4.2.0/d9/d1d/structcv_1_1cudev_1_1sqr__func.html#a653443fdeefc72965e7ff269f28bb9dc',1,'cv::cudev::sqr_func::operator()()'],['https://docs.opencv.org/4.2.0/d9/d47/structcv_1_1cudev_1_1sqrt__func.html#a3c13827c0c81360668c03101aec9f447',1,'cv::cudev::sqrt_func::operator()()'],['https://docs.opencv.org/4.2.0/d4/d9d/structcv_1_1cudev_1_1sqrt__func_3_01double_01_4.html#a0ed5e0351bd2e8fc4012c231307269b4',1,'cv::cudev::sqrt_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d8/dd2/structcv_1_1cudev_1_1sqrt__func_3_01float_01_4.html#a03e90b3bb7445759653b84ccd259a22d',1,'cv::cudev::sqrt_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/da/d64/structcv_1_1cudev_1_1sqrt__func_3_01schar_01_4.html#aa4afd2cf29659cfb2e992b78aa383038',1,'cv::cudev::sqrt_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d6a/structcv_1_1cudev_1_1sqrt__func_3_01short_01_4.html#a0f6eeddb105a2097a452b52c1dfc384b',1,'cv::cudev::sqrt_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d9/d33/structcv_1_1cudev_1_1sqrt__func_3_01uchar_01_4.html#a3196e3954b0e70277deba6b6ded42ec7',1,'cv::cudev::sqrt_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d0/d7b/structcv_1_1cudev_1_1sqrt__func_3_01uint_01_4.html#a42e59fdead1f2063b1b06e89b3d915e9',1,'cv::cudev::sqrt_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/df/df4/structcv_1_1cudev_1_1sqrt__func_3_01ushort_01_4.html#adac64ea929bfe2d165affcbf44a767df',1,'cv::cudev::sqrt_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/db/d3b/classcv_1_1stereo_1_1StarKernelCensus.html#a3d6e4998cc5b42e0fce4cc490251de9e',1,'cv::stereo::StarKernelCensus::operator()()'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a67ee54d1221b03d9866393effaeeb8dd',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, GpuMat &keypoints)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#aa0ed78380fe2142a729e424aa195263c',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, GpuMat &keypoints, GpuMat &descriptors, bool useProvidedKeypoints=false)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#a9bb91e3bffd09e0e65c91c45da669304',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, std::vector< KeyPoint > &keypoints)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#aec817660a3ecbb64f0afa54354a8af5c',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, std::vector< KeyPoint > &keypoints, GpuMat &descriptors, bool useProvidedKeypoints=false)'],['https://docs.opencv.org/4.2.0/db/d06/classcv_1_1cuda_1_1SURF__CUDA.html#ad254c526ba8d61e66a40ebabf5a6c847',1,'cv::cuda::SURF_CUDA::operator()(const GpuMat &img, const GpuMat &mask, std::vector< KeyPoint > &keypoints, std::vector< float > &descriptors, bool useProvidedKeypoints=false)'],['https://docs.opencv.org/4.2.0/df/df7/classcv_1_1SVD.html#ad9ade269f8234b171413e4ff639a3128',1,'cv::SVD::operator()()'],['https://docs.opencv.org/4.2.0/dd/d24/classcv_1_1stereo_1_1SymetricCensus.html#a8b4e095d57a6cc44fd4997af55f2d34b',1,'cv::stereo::SymetricCensus::operator()()'],['https://docs.opencv.org/4.2.0/d7/d3e/structcv_1_1cudev_1_1tan__func.html#a2482523afd1e226cf46eca69ab6ded31',1,'cv::cudev::tan_func::operator()()'],['https://docs.opencv.org/4.2.0/db/dc4/structcv_1_1cudev_1_1tan__func_3_01double_01_4.html#abe568bfe0f6458d5f94824e3c8133869',1,'cv::cudev::tan_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d4e/structcv_1_1cudev_1_1tan__func_3_01float_01_4.html#ac7092cea3ad156fa30ff5a7aeefb1dfa',1,'cv::cudev::tan_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d7/d9d/structcv_1_1cudev_1_1tan__func_3_01schar_01_4.html#a5d739a35f50c97b273f822c325204d24',1,'cv::cudev::tan_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/dbd/structcv_1_1cudev_1_1tan__func_3_01short_01_4.html#a57af0b55d41554ecea3a1bf5ef4c7653',1,'cv::cudev::tan_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d0d/structcv_1_1cudev_1_1tan__func_3_01uchar_01_4.html#a03d6d6b2c000bd957bfa4df61f8a744f',1,'cv::cudev::tan_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d9e/structcv_1_1cudev_1_1tan__func_3_01uint_01_4.html#a6bf5488503341bbacb61b959103c7702',1,'cv::cudev::tan_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d63/structcv_1_1cudev_1_1tan__func_3_01ushort_01_4.html#a4ad3366dca634dbe0edb6b8e8e4a3739',1,'cv::cudev::tan_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d5/d7b/structcv_1_1cudev_1_1tanh__func.html#acdf93453f1d2131aecd26c37d3cfc79d',1,'cv::cudev::tanh_func::operator()()'],['https://docs.opencv.org/4.2.0/d4/d9f/structcv_1_1cudev_1_1tanh__func_3_01double_01_4.html#a58e54574cb02f13e2129204c349a8f9c',1,'cv::cudev::tanh_func< double >::operator()()'],['https://docs.opencv.org/4.2.0/dc/da0/structcv_1_1cudev_1_1tanh__func_3_01float_01_4.html#a7e21f8cf9b8d4cc3fa043fc80c3ea11c',1,'cv::cudev::tanh_func< float >::operator()()'],['https://docs.opencv.org/4.2.0/d5/dfc/structcv_1_1cudev_1_1tanh__func_3_01schar_01_4.html#ab297810c17a3e1b9c39b32d71c2b6f9f',1,'cv::cudev::tanh_func< schar >::operator()()'],['https://docs.opencv.org/4.2.0/d8/db4/structcv_1_1cudev_1_1tanh__func_3_01short_01_4.html#a66d82124b6cfae4ab90e027781b3e366',1,'cv::cudev::tanh_func< short >::operator()()'],['https://docs.opencv.org/4.2.0/d8/d5a/structcv_1_1cudev_1_1tanh__func_3_01uchar_01_4.html#a217df735a2b55e8c29cc1877b65ffc96',1,'cv::cudev::tanh_func< uchar >::operator()()'],['https://docs.opencv.org/4.2.0/df/dc6/structcv_1_1cudev_1_1tanh__func_3_01uint_01_4.html#a8d6d358bc9a39244a0d829745d9b782f',1,'cv::cudev::tanh_func< uint >::operator()()'],['https://docs.opencv.org/4.2.0/d6/d68/structcv_1_1cudev_1_1tanh__func_3_01ushort_01_4.html#a451a091258448763568c3148ecc90b1b',1,'cv::cudev::tanh_func< ushort >::operator()()'],['https://docs.opencv.org/4.2.0/d2/d09/structcv_1_1cudev_1_1TexturePtr.html#a37f533d175f7d132cfa0dbda2e9e4426',1,'cv::cudev::TexturePtr::operator()()'],['https://docs.opencv.org/4.2.0/df/df5/structcv_1_1cudev_1_1ThreshBinaryFunc.html#a52270b71a069ba892ffb1d99691466c3',1,'cv::cudev::ThreshBinaryFunc::operator()()'],['https://docs.opencv.org/4.2.0/da/d5e/structcv_1_1cudev_1_1ThreshBinaryInvFunc.html#a08286d7152097d42df33551d2459bc40',1,'cv::cudev::ThreshBinaryInvFunc::operator()()'],['https://docs.opencv.org/4.2.0/df/dd9/structcv_1_1cudev_1_1ThreshToZeroFunc.html#a5b5819f10125f84dc7ac7718b0515207',1,'cv::cudev::ThreshToZeroFunc::operator()()'],['https://docs.opencv.org/4.2.0/d8/d7e/structcv_1_1cudev_1_1ThreshToZeroInvFunc.html#a7b9e1075aefc2fbece94477f96efeab8',1,'cv::cudev::ThreshToZeroInvFunc::operator()()'],['https://docs.opencv.org/4.2.0/d0/d44/structcv_1_1cudev_1_1ThreshTruncFunc.html#a58e38cea97c6bc26b2a221b94af6b44a',1,'cv::cudev::ThreshTruncFunc::operator()()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a84b1f570775c927202a55ab1cccd9542',1,'cv::UMat::operator()(Range rowRange, Range colRange) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a7679d5bea4421e360b90225d348e3fa3',1,'cv::UMat::operator()(const Rect &roi) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a0e245fe34228df0f31d3e3fdb6fa89d3',1,'cv::UMat::operator()(const Range *ranges) const'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#af4e69198d95654e9fe2bd03dd1feee38',1,'cv::UMat::operator()(const std::vector< Range > &ranges) const'],['https://docs.opencv.org/4.2.0/d2/d83/structcv_1_1cudev_1_1UnaryNegate.html#a62a01b748a748f41e8151aa12feedd5b',1,'cv::cudev::UnaryNegate::operator()()'],['https://docs.opencv.org/4.2.0/dd/d01/structcv_1_1cudev_1_1UnaryTransformPtr.html#aeaea7fc6e3a4cebe1a5b4dbfd8aa916c',1,'cv::cudev::UnaryTransformPtr::operator()()'],['https://docs.opencv.org/4.2.0/d4/d57/structcv_1_1cudev_1_1UnaryTupleAdapter.html#ac5ef68bb68529b28058ef3728c5e8e28',1,'cv::cudev::UnaryTupleAdapter::operator()()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'cv::Vec::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'cv::Vec::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< _Tp, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< _Tp, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, 2 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, 2 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, 4 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, 4 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< double, nFeatures >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< double, nFeatures >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< float, 2 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< float, 2 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a4c3985698335fe7c60925a39697237ca',1,'Vec< float, 3 >::operator()(int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae1bd7f947444d42ee624a00e0cabe413',1,'Vec< float, 3 >::operator()(int i)'],['https://docs.opencv.org/4.2.0/da/d2c/structcv_1_1cudev_1_1WithOutMask.html#a0c1b6a4167eb490a4ccb48fd8c6fdacf',1,'cv::cudev::WithOutMask::operator()()'],['https://docs.opencv.org/4.2.0/dd/de4/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_01_4_01_4.html#a52971b170c17e2be804c1d31cb760264',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1 > >::operator()()'],['https://docs.opencv.org/4.2.0/d4/dff/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_01_4_01_4.html#a68f55e98fda4a897c29d2d4f49826f27',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2 > >::operator()()'],['https://docs.opencv.org/4.2.0/dd/d2b/structcv_1_1cudev_1_1ZipPtr_3_01tuple_3_01Ptr0_00_01Ptr1_00_01Ptr2_00_01Ptr3_01_4_01_4.html#af47fca22fa2dd342cd135d15a5015495',1,'cv::cudev::ZipPtr< tuple< Ptr0, Ptr1, Ptr2, Ptr3 > >::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09219.html#a01fb6415bad2c6df91eb607f863fd9e5',1,'__gnu_cxx::subtractive_rng::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09463.html#a3cf37f56d2b37200d0708f75f872ada7',1,'__gnu_parallel::__accumulate_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09411.html#afba73305cf46d20618b0deb3cbd4a1ba',1,'__gnu_parallel::__adjacent_find_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09459.html#a56b55a96d25ead3f5a39c062913f7804',1,'__gnu_parallel::__count_if_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09455.html#a0e1e5ee862269d12a04fd59864f07e66',1,'__gnu_parallel::__count_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09435.html#a1e3e5bf39d889705dbb9424ac1a4fc01',1,'__gnu_parallel::__fill_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09419.html#ab86537005f7f266bbaebc18f9d44b077',1,'__gnu_parallel::__find_first_of_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09407.html#ab5c063395b4e4f3e1be257ac5327f8b2',1,'__gnu_parallel::__find_if_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09427.html#a96ab04030fc97ceace13df652312cca7',1,'__gnu_parallel::__for_each_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09431.html#aace006f0e22d008dbfbd4170ec504ff4',1,'__gnu_parallel::__generate_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09471.html#a5a619614699498f9a13f1c64d27005e6',1,'__gnu_parallel::__identity_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09467.html#aa518cf31e5b678e0ad8ed27ec50b995f',1,'__gnu_parallel::__inner_product_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09415.html#acce7eaf03f5dcb028e255f8b40ad9dfd',1,'__gnu_parallel::__mismatch_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09451.html#aac84e11aceb0e9a3a784639d4df228c3',1,'__gnu_parallel::__replace_if_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09447.html#af3f1faaa44808a57f241b03a0f9be9a5',1,'__gnu_parallel::__replace_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09439.html#a8292d668f885bee0747c9d154fb9a77e',1,'__gnu_parallel::__transform1_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09443.html#a4e0226a0b61723e0e8e716fb3a8be78f',1,'__gnu_parallel::__transform2_selector::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09479.html#ac510e7f38f4ddc7d13db646cb65d2e25',1,'__gnu_parallel::_Nothing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09671.html#ac0da7b514eddc08518d496c93015bb39',1,'__gnu_parallel::_RandomNumber::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09671.html#a58e1450c9d06b629dde759438bc7d83c',1,'__gnu_parallel::_RandomNumber::operator()(uint64_t local_supremum)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11151.html#a01ee7eade182938e160f79cb9c68d73c',1,'__gnu_pbds::direct_mask_range_hashing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11155.html#a0b75e4a9b61ac153724d2c120d2a56dd',1,'__gnu_pbds::direct_mod_range_hashing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11143.html#a8974edcb80c2e1a8aee992a01b517b34',1,'__gnu_pbds::linear_probe_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#aba9450255401d4b96c50bf7c56d4c49a',1,'__gnu_pbds::lu_counter_policy::operator()() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11183.html#afa66044dd6264f0c6d6f1cfd05c2fe34',1,'__gnu_pbds::lu_counter_policy::operator()(metadata_reference r_data) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html#afa1064441fc28b323b7b28176686ef65',1,'__gnu_pbds::lu_move_to_front_policy::operator()() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11179.html#a009f2dea97b29bdffa640258f86b6135',1,'__gnu_pbds::lu_move_to_front_policy::operator()(metadata_reference r_metadata) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11147.html#ae22be7552bf62d81aa93eb0b151e6016',1,'__gnu_pbds::quadratic_probe_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11783.html#aa6ced743b2988788dea80b762e85986d',1,'__gnu_pbds::sample_probe_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11787.html#aa99807ceec7e628556967db52a07bc0b',1,'__gnu_pbds::sample_range_hashing::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11791.html#a0dd67bb1412f11f8898f67bb3cd1e8ec',1,'__gnu_pbds::sample_ranged_hash_fn::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12083.html#ae4db417d4455178d78933ae2fae0c0c1',1,'__gnu_pbds::sample_trie_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#ac935e838124407bc51c0bf7c01933341',1,'__gnu_pbds::sample_update_policy::operator()() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11859.html#a6eefac672a1bb0513d6d3b145d35fd56',1,'__gnu_pbds::sample_update_policy::operator()(metadata_reference) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#a9f14ab1bc7aee93a77e4c73c37d1b9f5',1,'__gnu_pbds::tree_order_statistics_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#ac03a1d37b467c2f12926fcb78fb2803a',1,'__gnu_pbds::trie_order_statistics_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11367.html#a8366820208119a5e4179d91d09d8ea9b',1,'__gnu_pbds::trie_prefix_search_node_update::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a72dba48d3f9781e948c535e37e7eabeb',1,'gamma_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a286dd68452eebd137ec7be7852a58fca',1,'gamma_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a72dba48d3f9781e948c535e37e7eabeb',1,'gamma_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a286dd68452eebd137ec7be7852a58fca',1,'gamma_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae67f6ec56c5564a3521d734d90f35501',1,'normal_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a159f2f44c19a01c99cb937297d03604c',1,'normal_distribution< double >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae67f6ec56c5564a3521d734d90f35501',1,'normal_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a159f2f44c19a01c99cb937297d03604c',1,'normal_distribution< result_type >::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06427.html#aec456e48e7dd746d11b2836368b7ed6d',1,'std::bernoulli_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#a81e88f1000ed08018856b1b908acae12',1,'std::binomial_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06435.html#aff0946f83a897c9f8b42f88d9e6d24c6',1,'std::binomial_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06403.html#ae2c1bb8200f59e2e62b591676fffbf41',1,'std::cauchy_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06395.html#a2ddd460528095405f9ee56cf681f306a',1,'std::chi_squared_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07995.html#a8ba28722822c984007c41986305ee762',1,'std::default_delete::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07999.html#a00890fd27c38569b6d907b8f93bd7833',1,'std::default_delete< _Tp[]>::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06343.html#ab96a2de7f6360a7fc295a0d03f0dfd2e',1,'std::discard_block_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06491.html#a8213bca3ac8f3617fd3bec4f8ecd55f8',1,'std::discrete_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06467.html#a11a94d907e89a229cfd4083cb8e6a14c',1,'std::exponential_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06483.html#a88eda5b7e1af374a061fdc284e8c2baa',1,'std::extreme_value_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06411.html#ab172a885f02391e497338955fbd5a5b7',1,'std::fisher_f_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#ab0bfbd15574ba442c644604dc18c4750',1,'std::function< _Res(_ArgTypes...)>::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a72dba48d3f9781e948c535e37e7eabeb',1,'std::gamma_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06387.html#a286dd68452eebd137ec7be7852a58fca',1,'std::gamma_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06443.html#a4a41c317cae02db9d8cc20dbbcd4d77d',1,'std::geometric_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06347.html#a61bc80ca1745e63a5f22307498737844',1,'std::independent_bits_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06331.html#ae42fad7d735fb5d8d96076f70f2f65d4',1,'std::linear_congruential_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#ad9d4f2f1dd2404eeb399f7609e50f1fb',1,'std::locale::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06379.html#ae6fb96729b574441550992a32599df9a',1,'std::lognormal_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06451.html#a1c8275129594f6b1ac0830e2550698dd',1,'std::negative_binomial_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#ae67f6ec56c5564a3521d734d90f35501',1,'std::normal_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06371.html#a159f2f44c19a01c99cb937297d03604c',1,'std::normal_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06499.html#a9cd86c19e7864fe4f6e7fec1965210e9',1,'std::piecewise_constant_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06507.html#a3853eb2d024be1171d980339eefb0470',1,'std::piecewise_linear_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a4ca984da5920a260845933c37d20cc2e',1,'std::poisson_distribution::operator()(_UniformRandomNumberGenerator &__urng)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06459.html#a09b00c6571fa3099f12918955723f41d',1,'std::poisson_distribution::operator()(_UniformRandomNumberGenerator &__urng, const param_type &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06351.html#af3cc39eaa42c2d1177cd98fa8e2e91e3',1,'std::shuffle_order_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06419.html#a79b8f920240c03c968f96fc34b15c409',1,'std::student_t_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06339.html#a7b6aa59d4719950a6014d38e1559295c',1,'std::subtract_with_carry_engine::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07983.html#a40babba47578a39b3bdc5f9b56a64268',1,'std::uniform_int_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06363.html#ae424a70312170d3b285bf6039b58cb58',1,'std::uniform_real_distribution::operator()()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06475.html#a7f3883c7078a32e87c72157e91776416',1,'std::weibull_distribution::operator()()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AMDOrdering.html#afce433557abcba9e49fa81581a58fa51',1,'Eigen::AMDOrdering::operator()(const MatrixType &mat, PermutationType &perm)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AMDOrdering.html#a7f3fd7224b084f0f5655c97ea8eb6466',1,'Eigen::AMDOrdering::operator()(const SparseSelfAdjointView< SrcType, SrcUpLo > &mat, PermutationType &perm)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1COLAMDOrdering.html#a708cb20191dcd79856d922f262405946',1,'Eigen::COLAMDOrdering::operator()()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#af9fadc22d12e48c82745dad534a1671a',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::operator()(Index index) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#ab3dbba4a15d0fe90185d2900e5ef0fd1',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::operator()(Index row, Index col) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#a0171eee1d9e582d1ac7ec0f18f5f615a',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::operator()(Index index)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#ae6ba07bad9e3026afe54806fdefe32bb',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::operator()(Index row, Index col)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1NaturalOrdering.html#aa39e772105ed66da9e909f2a9385be37',1,'Eigen::NaturalOrdering::operator()()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a09fce82b9bdedb5deb2b223a3d716d3f',1,'Eigen::Transform::operator()(Index row, Index col)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a9672c84cb1477eee118be144e7e5d581',1,'Eigen::Transform::operator()(Index row, Index col) const'],['https://nlohmann.github.io/json/doxygen/structstd_1_1hash_3_01nlohmann_1_1json_01_4_aec1567d1fa47dbe5b77954dce3a55b64.html#aec1567d1fa47dbe5b77954dce3a55b64',1,'std::hash< nlohmann::json >::operator()()'],['https://docs.opencv.org/4.2.0/d9/df8/group__tracking.html#ga68c6b644dd17b10637cf74117c44e35e',1,'operator()()(Global Namespace)']]], + ['operator_2a_105',['operator*',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a73e4a0844474b25bf254b08c7e4978d6',1,'cv::FileNodeIterator::operator*()'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a11df3b7dbaf0e16ddb430eab3b62e78f',1,'cv::LineIterator::operator*()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#ad54179860880cbc148f2708c5b1fa2f6',1,'cv::MatConstIterator::operator*()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a44e02be61a20baa1ab83de13c7c956b4',1,'cv::MatConstIterator_::operator*()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac66fa81bbfc418c535a7f9f49a900554',1,'cv::MatExpr::operator*(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7f68410debc724a5be5235977b902be5',1,'cv::MatExpr::operator*(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7994c3ff3973cc56aac839dc8683ba51',1,'cv::MatExpr::operator*(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a951bede696efc7ad39b2326c257cb9b5',1,'cv::MatExpr::operator*(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae3d5b4a180f62f30b5874243af312ebb',1,'cv::MatExpr::operator*(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a54d49dc23f7a659f61ec5401b9c48d05',1,'cv::MatExpr::operator*(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaac1439d54057753cddc9330f8f56ea6',1,'cv::MatExpr::operator*(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2eb63d9f7b2d398c8714239114ff2b4e',1,'cv::MatExpr::operator*(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a31e53f019aa164af7e7276440f57f497',1,'cv::MatExpr::operator*(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69bdf2007fa634306dea2e7065f839f9',1,'cv::MatExpr::operator*(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac66fa81bbfc418c535a7f9f49a900554',1,'cv::MatExpr::operator*(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7f68410debc724a5be5235977b902be5',1,'cv::MatExpr::operator*(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7994c3ff3973cc56aac839dc8683ba51',1,'cv::MatExpr::operator*(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a951bede696efc7ad39b2326c257cb9b5',1,'cv::MatExpr::operator*(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae3d5b4a180f62f30b5874243af312ebb',1,'cv::MatExpr::operator*(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a54d49dc23f7a659f61ec5401b9c48d05',1,'cv::MatExpr::operator*(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaac1439d54057753cddc9330f8f56ea6',1,'cv::MatExpr::operator*(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2eb63d9f7b2d398c8714239114ff2b4e',1,'cv::MatExpr::operator*(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a31e53f019aa164af7e7276440f57f497',1,'cv::MatExpr::operator*(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69bdf2007fa634306dea2e7065f839f9',1,'cv::MatExpr::operator*(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a30669620dc39593b9c21b373fd83cac5',1,'cv::MatIterator_::operator*()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'cv::Matx::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'cv::Matx::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'cv::Matx::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'cv::Matx::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'cv::Matx::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'cv::Matx::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'cv::Matx::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'cv::Matx::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'cv::Matx::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< _Tp, cn, 1 >::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< _Tp, cn, 1 >::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< _Tp, cn, 1 >::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< _Tp, cn, 1 >::operator*(int alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< _Tp, cn, 1 >::operator*(float alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< _Tp, cn, 1 >::operator*(double alpha, const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, l > &a, const Matx< _Tp, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< _Tp, cn, 1 >::operator*(const Matx< _Tp, m, n > &a, const Vec< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 1, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 1, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 1, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 1, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 1, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 1, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 1, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 2 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 2 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 2 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 2 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 2 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 2 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 2 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 2, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 2, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 2, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 2, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 3 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 3 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 3 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 3 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 3, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 3, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 3, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 3, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 4, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 4, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 4, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, 4, 4 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, 4, 4 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, 4, 4 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, 4, 4 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, cn, 1 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, cn, 1 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, cn, 1 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< double, cn, 1 >::operator*(int alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< double, cn, 1 >::operator*(float alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< double, cn, 1 >::operator*(double alpha, const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, l > &a, const Matx< double, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< double, cn, 1 >::operator*(const Matx< double, m, n > &a, const Vec< double, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 2, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 2, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 2, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 2, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 2, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 2, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 2, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 3, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 3, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 3, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, 3, 3 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, 3, 3 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, 3, 3 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, 3, 3 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, cn, 1 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, cn, 1 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, cn, 1 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float, cn, 1 >::operator*(int alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float, cn, 1 >::operator*(float alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float, cn, 1 >::operator*(double alpha, const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, l > &a, const Matx< float, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float, cn, 1 >::operator*(const Matx< float, m, n > &a, const Vec< float, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float_type, 4, 4 >::operator*(int alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float_type, 4, 4 >::operator*(float alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float_type, 4, 4 >::operator*(double alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, l > &a, const Matx< float_type, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, const Vec< float_type, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad18f4c37e7b9f39d690f836bc0ed4101',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7d329d0dadd008dd86b678e284e83fb7',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ad6d1570d4ea5feddfb331ae5cbf2e02e',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a07b3c8fb6327ee0013f3fa0621003f74',1,'Matx< float_type, 4, 4 >::operator*(int alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a40633694e3f47c3673b60a45603b920e',1,'Matx< float_type, 4, 4 >::operator*(float alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa4fe3ea0a6daeca226f434b3fc63b27f',1,'Matx< float_type, 4, 4 >::operator*(double alpha, const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7344c95f9767d94430094ae30eb34ecf',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, l > &a, const Matx< float_type, l, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a80aca6dc4eab4062e83183cacc5ee952',1,'Matx< float_type, 4, 4 >::operator*(const Matx< float_type, m, n > &a, const Vec< float_type, n > &b)'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a603a8a1c3cc866977c8fbd8b55314c86',1,'cv::MatxCommaInitializer::operator*()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a603a8a1c3cc866977c8fbd8b55314c86',1,'MatxCommaInitializer< _Tp, m, 1 >::operator*()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a98a3906afc1a4005f761124f3fd22e8e',1,'cv::util::optional::operator*()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a37e1e46df264e1fddf325db1e6903c5b',1,'cv::util::optional::operator*() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac2116f5bce2914d578953c6ac8c0da16',1,'cv::softdouble::operator*()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab2ccc99b90013df8b9cf49f6c63842ff',1,'cv::softfloat::operator*()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a1db341e36da96bff57ce3c8d16aa85a2',1,'cv::SparseMatConstIterator_::operator*()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a26262be0fb6504badd2d515e7dbbd648',1,'cv::SparseMatIterator_::operator*()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'cv::Vec::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'cv::Vec::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'cv::Vec::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'cv::Vec::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'cv::Vec::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'cv::Vec::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'cv::Vec::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'cv::Vec::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'cv::Vec::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< _Tp, 4 >::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< _Tp, 4 >::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< _Tp, 4 >::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< _Tp, 4 >::operator*(int alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< _Tp, 4 >::operator*(float alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< _Tp, 4 >::operator*(double alpha, const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< _Tp, 4 >::operator*(const Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 2 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 2 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 2 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 2 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 2 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 2 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 2 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 2 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 2 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 3 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 3 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 3 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 3 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 3 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 3 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 3 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 3 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 3 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 4 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 4 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 4 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 4 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, 4 >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, 4 >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, 4 >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, 4 >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, 4 >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< double, nFeatures >::operator*(int alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< double, nFeatures >::operator*(float alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< double, nFeatures >::operator*(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< double, nFeatures >::operator*(double alpha, const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< double, nFeatures >::operator*(const Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 2 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 2 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 2 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 2 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 2 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 2 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 2 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 2 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 2 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 3 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 3 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 3 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 3 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a43368955ea589fc82275c63b762f2608',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab2ac7977f7fda09b15e7e0d2cf397547',1,'Vec< float, 3 >::operator*(int alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#af9a8a1cea16622999233a2fae540318c',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7795b3f77bcb057d08646d1fcc3b7f75',1,'Vec< float, 3 >::operator*(float alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a7395492deee361ee10cea847ca2c546f',1,'Vec< float, 3 >::operator*(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ab69280b26c9811d17d193d2fe3a5d021',1,'Vec< float, 3 >::operator*(double alpha, const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ae90c45141c79c61b8ccfd77554a04172',1,'Vec< float, 3 >::operator*(const Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d1/d3e/classcv_1_1VecCommaInitializer.html#a43e67fe37475c2c6e7081285cb7a8f56',1,'cv::VecCommaInitializer::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a09753efe38fc494639cbbe005409fe51',1,'__gnu_debug::_Safe_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a8e237d9370458e65ea6141b677e8e8f8',1,'__gnu_debug::_Safe_local_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#a89e62967a92648f52f3da16144bf9b75',1,'__gnu_parallel::_GuardedIterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#aeebd8eab002abaceeeeedbb0850ae617',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11631.html#aab710c87290d148b6dd2eb260ff27a1d',1,'__gnu_pbds::detail::bin_search_tree_node_it_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a50d89bdcb26164ff380a312673cf0f06',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a50d89bdcb26164ff380a312673cf0f06',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a60ad369139de2b800a5a729f10b992bb',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a60ad369139de2b800a5a729f10b992bb',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11867.html#a89338f1c18b5234bf80ef61c8f839359',1,'__gnu_pbds::detail::ov_tree_node_it_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a951a43bd97e277ad638e8cf8229d0af3',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11951.html#a575ff0f4d10725779405d8e83dc27463',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a09753efe38fc494639cbbe005409fe51',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a09753efe38fc494639cbbe005409fe51',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#aa36fe65e861c9fe0e67b77f28d0fea0b',1,'const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#a44f292f812c56ddf38a1cded7175fa22',1,'iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#aa36fe65e861c9fe0e67b77f28d0fea0b',1,'point_const_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a07f5dff121401de22bbc2647de595243',1,'point_iterator_::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a2e044fd0c71fba38157d3aa588be4518',1,'std::auto_ptr::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#a07c1b7a9f42341013f7a44752596d16e',1,'std::back_insert_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#a1686a970fd21798542dd32e3c2208b95',1,'std::front_insert_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a1a406c868feb4c886b002870abeb8546',1,'std::insert_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#aa68118742e48a3296a39611184764153',1,'std::istreambuf_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#a179357ce2cd1d4a53d9c0e5efb65e4df',1,'std::ostreambuf_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a89ee258fe95b81e17fb0eaf4cb0fd565',1,'std::regex_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a0ae03837c2bb4c283a500b70e00743bd',1,'std::regex_token_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a7af5d174f9cb1016e5028e6a8716753b',1,'std::reverse_iterator::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'std::unique_ptr::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Codecvt >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Res_type >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Result< _Res > >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< _Result_base >::operator*()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a8e080072591682c8d1fb2bf468f51188',1,'unique_ptr< bool[]>::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#ad0a428546d0ff7ed06cca4c4a1e4522a',1,'Eigen::AngleAxis::operator*(const AngleAxis &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a36fa315e0326beacbf249b56fcd0596e',1,'Eigen::AngleAxis::operator*(const QuaternionType &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1HouseholderSequence.html#ac57e5a22f1646e04a4f8b4cba3825928',1,'Eigen::HouseholderSequence::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1JacobiRotation.html#ada8389f291839964d7b481464f0e4e94',1,'Eigen::JacobiRotation::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a36fb95c37f0a454e0e2e5cb120b2df7f',1,'Eigen::MatrixBase::operator*(const DiagonalBase< DiagonalDerived > &diagonal) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae2d220efbf7047f0894787888288cfcc',1,'Eigen::MatrixBase::operator*(const MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a36fb95c37f0a454e0e2e5cb120b2df7f',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator*(const DiagonalBase< DiagonalDerived > &diagonal) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae2d220efbf7047f0894787888288cfcc',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator*(const MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a36fb95c37f0a454e0e2e5cb120b2df7f',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator*(const DiagonalBase< DiagonalDerived > &diagonal) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#ae2d220efbf7047f0894787888288cfcc',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator*(const MatrixBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'Eigen::PermutationBase::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'Eigen::PermutationBase::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a865e88989a76b7e92f39bad5250b89c4',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator*(const InverseImpl< Other, PermutationStorage > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#ae81574e059f6b9b7de2ea747fd346a1b',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator*(const PermutationBase< Other > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'Eigen::QuaternionBase::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afdf1dc395c1cff6716ec9b80fd15b414',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#adbfbf2d1ccdf50999bad7688348f4ac2',1,'Eigen::Rotation2D::operator*(const Rotation2D &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#ad0ad69c781232313b7d01f981148f230',1,'Eigen::Rotation2D::operator*(const Vector2 &vec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'Eigen::RotationBase::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'Eigen::RotationBase::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'Eigen::RotationBase::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'Eigen::RotationBase::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< AngleAxis< _Scalar >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Derived, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Derived, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Derived, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Derived, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Map< const Quaternion< _Scalar >, _Options >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Map< Quaternion< _Scalar >, _Options >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Quaternion< _Scalar, _Options >, 3 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a09a4757e7aff7a95bebf4fa8a965a4eb',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const EigenBase< OtherDerived > &e) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#aaca1c3d834e2bc7ebfd046d96cac990c',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a26d0603783666526a98d08bd45d9c751',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1RotationBase.html#a05af64a1bc759c5fed4ff7afd1414ba4',1,'RotationBase< Rotation2D< _Scalar >, 2 >::operator*(const UniformScaling< Scalar > &s) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af18c39fdc7783c63766ba22ce0e784c3',1,'Eigen::SelfAdjointView::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#af18c39fdc7783c63766ba22ce0e784c3',1,'SelfAdjointView< const Derived, UpLo >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'Eigen::SparseMatrixBase::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< Transpose< MatrixType > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#a9d4d71b3f34389e6fc01f2b86e43f7a4',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a887e3b5fa468af8413276141ddc8bb93',1,'Eigen::SparseSelfAdjointView::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a9d1e5ef26775e3b43be08fd4ae191aa8',1,'Eigen::SparseSelfAdjointView::operator*(const SparseMatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a887e3b5fa468af8413276141ddc8bb93',1,'SparseSelfAdjointView< const Derived, UpLo >::operator*(const MatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseSelfAdjointView.html#a9d1e5ef26775e3b43be08fd4ae191aa8',1,'SparseSelfAdjointView< const Derived, UpLo >::operator*(const SparseMatrixBase< OtherDerived > &rhs) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ab3d93a2aba9d06e7d134798f92617da7',1,'Eigen::Transform::operator*(const DiagonalBase< DiagonalDerived > &b) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a257ab8b9141982bd6f56771ba822526f',1,'Eigen::Transform::operator*(const EigenBase< OtherDerived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a7e75d983600d35b603f740a3a28bbc6c',1,'Eigen::Transform::operator*(const Transform &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#ad4fc26aef2abfb9fdadb7d64aaf58c31',1,'Eigen::Transform::operator*(const Transform< Scalar, Dim, OtherMode, OtherOptions > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a2289ae59c8f871d9d9c73ba7eeb035f8',1,'Eigen::Translation::operator*(const EigenBase< OtherDerived > &linear) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a62a95caa45e0aa178e0b2759c78874b1',1,'Eigen::Translation::operator*(const MatrixBase< Derived > &vec) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a37840d7fa515418e143593efbd21c6b3',1,'Eigen::Translation::operator*(const RotationBase< Derived, Dim > &r) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#ac0e625c8d90f899be9c73b77592a003f',1,'Eigen::Translation::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#aa79f1217e27556e0524260e172a0b081',1,'Eigen::Translation::operator*(const Translation &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Translation.html#a156c8003ff3830756727e805cf98c0ab',1,'Eigen::Translation::operator*(const UniformScaling< Scalar > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#ad21c964c4d5dff8aa496558ef74731f1',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a8abd57298d10bd620bdfc459d22e8add',1,'Eigen::UniformScaling::operator*(const MatrixBase< Derived > &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#ad8c9401526e9ade727036b6d255fbdc0',1,'Eigen::UniformScaling::operator*(const Transform< Scalar, Dim, Mode, Options > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a19c405341f2c861eb0ddfc4f760fecf8',1,'Eigen::UniformScaling::operator*(const Translation< Scalar, Dim > &t) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#af3044cffe5703a1946c33a953b0f9bb6',1,'Eigen::UniformScaling::operator*(const UniformScaling &other) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1UniformScaling.html#a8f79e131479dbe709ee1173b1be9a8f0',1,'Eigen::UniformScaling::operator*(const MatrixBase< Derived > &matrix, const UniformScaling< Scalar > &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'Eigen::VectorwiseOp::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Derived, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Derived, Vertical >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator*()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a25ca4c1e409897feca669dee811533c9',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator*()'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gac57f9a35a5d4d1d3ba23d7871113cbd3',1,'cv::operator*(const Affine3< T > &affine1, const Affine3< T > &affine2)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gae9c102e6fd783bcf801e3432aca22e7b',1,'cv::operator*(const Affine3< T > &affine, const V &vector)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga548eb6a25623179405f13cad3954c01e',1,'cv::operator*(const Affine3f &affine, const Vec3f &vector)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaa607fd3c66c5c525cc4d39dc83ffd177',1,'cv::operator*(const Affine3d &affine, const Vec3d &vector)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga902a09c161f9ef0eedcf1414e58f3672',1,'cv::operator*(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487b453f9836d06d7324744d40dad0b',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6515905db0f226f4645878f458e4ff9',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf583d2c1fcd51d86094e1f30b2a58a2',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e1bad5a79815eec73d07827b885d1cd',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f79b898d0d82738072b4c49ef4086',1,'cv::cudev::operator*(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5a0a9a53dee95c42e80578e6440b218',1,'cv::cudev::operator*(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf27cecd7f8e200f4de479660583a8d15',1,'cv::cudev::operator*(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7f8cfe1eaafe131a814ee152b9a6e5a',1,'cv::cudev::operator*(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12aeb64e97cdb928290bf3fa82f05269',1,'cv::cudev::operator*(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fa7f2aa7dd5048da167a76587a44028',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93118d92ecb3c188a5c01ba769ba299e',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1a615302d17eda49ad2cec76c41859',1,'cv::cudev::operator*(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca535315088057b26c801a5705c1483',1,'cv::cudev::operator*(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510f2b0f9088282d3d47bf3093a38f78',1,'cv::cudev::operator*(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga163edd6ad357b0a6b49d3ad55b84f88c',1,'cv::cudev::operator*(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c75809716911fce2e047b0fb0c984b',1,'cv::cudev::operator*(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9db0eb6fb6dacf76ef4e8c8c304ddd9c',1,'cv::cudev::operator*(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b5811bca4633d9a78a6cae2adfa3dff',1,'cv::cudev::operator*(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafda944b16459e9a69661d33e7607fb41',1,'cv::cudev::operator*(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c7c955caf1909eb3c94363e1c7d3cb5',1,'cv::cudev::operator*(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4aaeb25bb41c3e4d44a51b4930532426',1,'cv::cudev::operator*(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43ee6bae7bda7ed2faf47b555790cb71',1,'cv::cudev::operator*(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02baabd5114aa4d102ed246afc6ce624',1,'cv::cudev::operator*(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga090d742c550d7e79878be81be9bdb2d2',1,'cv::cudev::operator*(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18a1ba838a8be508e64a43158cc45dfb',1,'cv::cudev::operator*(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e14d050010ca7c994471bf8467e32d3',1,'cv::cudev::operator*(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d7b1523f9c29c8a05ad2e41f191a2fe',1,'cv::cudev::operator*(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa1246b30b73eb70bba00a86fcd66395',1,'cv::cudev::operator*(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba88bd93ccad1c92db994fe051e342b',1,'cv::cudev::operator*(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98f94ba39b97b682e67464d85209e95',1,'cv::cudev::operator*(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84372ff1d3b6a2526b19964595096039',1,'cv::cudev::operator*(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3cc2c07d0405e5bef08000f75eb39e8',1,'cv::cudev::operator*(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c697c1a0f04f6e63a5f9da4ac327e85',1,'cv::cudev::operator*(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc87fb00c079b8edcfccd10ab13af8d2',1,'cv::cudev::operator*(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf59a024579c49c38a26a8a27e58297c1',1,'cv::cudev::operator*(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf912af0788d82a8d5aff820aaa99059',1,'cv::cudev::operator*(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88c3308c7efb95649564d8be2691284d',1,'cv::cudev::operator*(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb953af5f4125ba0182c6f8917300f90',1,'cv::cudev::operator*(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac65246dd4280d78429ab84b3fc9c2870',1,'cv::cudev::operator*(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f3e6aea5eb84905c559ef24412fa56',1,'cv::cudev::operator*(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga414e54087adc42f28fa754230dbab979',1,'cv::cudev::operator*(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac2d56a48c008a7e47b6310b109b376e',1,'cv::cudev::operator*(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d7b82717c159efcaadead58ee8142a8',1,'cv::cudev::operator*(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe5bfda78209600b7280b4bbd3cc3762',1,'cv::cudev::operator*(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae528d51efc3d013a608832c80bed2f8c',1,'cv::cudev::operator*(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga849d54a360b19427092bd7ce395da7c5',1,'cv::cudev::operator*(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f187e66cff592d0712ceaaa605e038',1,'cv::cudev::operator*(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac0afe2a5142d8098d2482c3814f8671',1,'cv::cudev::operator*(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5a08e2ac528655b1571f7fcb28c3c0',1,'cv::cudev::operator*(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5333891f8e975c6bc4e8f5813545b4b',1,'cv::cudev::operator*(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a3078c6a237576551f2d32606e32f10',1,'cv::cudev::operator*(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed7245cd9d9405b2de08c4b21fa08a5',1,'cv::cudev::operator*(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc381907b598468405b30d25a06c8ff',1,'cv::cudev::operator*(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e97c44127431ce49735fa92dbe4b25f',1,'cv::cudev::operator*(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9424ca0c0b214254e9adecb61adb2e5a',1,'cv::cudev::operator*(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae410ccbe1a6a58649302ccebf3c68949',1,'cv::cudev::operator*(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3b2a2d0d9a613d056c8523e155b674c',1,'cv::cudev::operator*(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85f5cd22ec760e4a2c14c78d80f4670d',1,'cv::cudev::operator*(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37e9268a08593a1e1bb839e2ce50ede9',1,'cv::cudev::operator*(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2429e2ed1796030785a93567ecf1776f',1,'cv::cudev::operator*(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1c28bd26127b812ce97c907b32fc9fc',1,'cv::cudev::operator*(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9cc4a289ee92829765bdf1958bc6e05',1,'cv::cudev::operator*(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e8f6dbe9d17cbd6cf04375fc5fca9ae',1,'cv::cudev::operator*(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f2fa27b61586fef88ab71db6e08faf0',1,'cv::cudev::operator*(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf9988841348e5856a943b777002e2b',1,'cv::cudev::operator*(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b8a526c1994b95e9ce76e3614acc86',1,'cv::cudev::operator*(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23920ad7c06382a913e3fcf217459a0b',1,'cv::cudev::operator*(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e9ba42884866db4b183e9028fd8b04f',1,'cv::cudev::operator*(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf5b25603db42e2eb11c8fdd17a7f25f',1,'cv::cudev::operator*(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c10d68845ebb0598810e51a2eba805c',1,'cv::cudev::operator*(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65f2d1823549a4b6dc52ef6d3054ba56',1,'cv::cudev::operator*(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1f3d4142ff834d438ef16a84fb23355',1,'cv::cudev::operator*(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fcd3e4a9f5ffcb684e3945e713a190f',1,'cv::cudev::operator*(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3caace9001357c38394f006fb1f634a',1,'cv::cudev::operator*(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2076958e894ca52570151a2308d8c781',1,'cv::cudev::operator*(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2741381920372f76817c4b9b76e28137',1,'cv::cudev::operator*(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2394ee2867506f375e14a36018519d8a',1,'cv::cudev::operator*(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6028638b717b193d90a9bbdd76a2797',1,'cv::cudev::operator*(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf250948634b71efc0820d731faa6cda1',1,'cv::cudev::operator*(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc861ca7430feace92266e538ed54b24',1,'cv::cudev::operator*(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08650b887f60c9a6c242c79f09c0cb69',1,'cv::cudev::operator*(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5522c68d2ae330209abc2765d6b50992',1,'cv::cudev::operator*(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacef4b96ed094bbed58d13a7071d1a87a',1,'cv::cudev::operator*(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5bd92d93ed5dbf9714a033550a83ed',1,'cv::cudev::operator*(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac18603d03fbcfdfd23751709f2238029',1,'cv::cudev::operator*(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5afec7fb5b0492668e86c8181f441aa',1,'cv::cudev::operator*(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2943f13db2702fddce4557a2e957c565',1,'cv::cudev::operator*(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32454c9d98afba5f7144a92cd6bf5acb',1,'cv::cudev::operator*(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16a1d022b4026918e85eaf28ac606a81',1,'cv::cudev::operator*(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8c6dcb676ea367c9e1dd89fd4f0abf4',1,'cv::cudev::operator*(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27de604fa033669bc0555199b31ef777',1,'cv::cudev::operator*(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1edec141c59b8a684d2592d1420949a1',1,'cv::cudev::operator*(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07a0d9f472b1baec9f5eabfff9d1eaf7',1,'cv::cudev::operator*(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6be4a7723c490f8b150c714436100e12',1,'cv::cudev::operator*(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddd96b00b4b034d26ce474707a4e5e1d',1,'cv::cudev::operator*(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7ef727c5051a2421616f0517740d984',1,'cv::cudev::operator*(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11b210a1793cf8e3d930c11dfda9ae6e',1,'cv::cudev::operator*(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55db9f51fac5b573deb32220a631ca9',1,'cv::cudev::operator*(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28a4888db08301e51da23d006f382653',1,'cv::cudev::operator*(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7020c56e082be84fca69fa2c9916a4e',1,'cv::cudev::operator*(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c25ca47380b7997200bb81a88f0323',1,'cv::cudev::operator*(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7b92c373c28a5c4e44617cbbe8b28d8',1,'cv::cudev::operator*(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dff9b27265d9a0d0b246618c2f6d190',1,'cv::cudev::operator*(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e7e1c4649f286432072ebf0bbcaa069',1,'cv::cudev::operator*(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98148cbe18fa5a1fe9cc37af9b2944da',1,'cv::cudev::operator*(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8af39ddbfd14cda64dc1ea8312ddeaab',1,'cv::cudev::operator*(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25a1baeb7c9b07639b599dcafb0a7dd1',1,'cv::cudev::operator*(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cfca580e4aed7f30b018f5b3b5f04de',1,'cv::cudev::operator*(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28a09636e8ddc34502754ef3cc45736',1,'cv::cudev::operator*(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd4d86a80e9a8ba4d0b8191946a7c7e4',1,'cv::cudev::operator*(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga500f12286f4bde3313357ee9b77522d8',1,'cv::cudev::operator*(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b1789f57a51f5db4560fe91f26bbd1',1,'cv::cudev::operator*(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5723f7cf916b1c9455c8581abcdeb505',1,'cv::cudev::operator*(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0e897f09e26316ca2aa0cbb965e1835',1,'cv::cudev::operator*(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga314f5a0e14f5b478c6c979776c26d203',1,'cv::cudev::operator*(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819a0d444655998d3ae70cd93b283319',1,'cv::cudev::operator*(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a5340751b48d6b199875c361804465',1,'cv::cudev::operator*(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bce5ffd4058a6549f3bb651f50bfe46',1,'cv::cudev::operator*(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ca0ada3b453db74593720374e9af90f',1,'cv::cudev::operator*(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2228f02f69514b9ea9c3bd30df71d0',1,'cv::cudev::operator*(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f24178f4139fa88be47e2b9f7126eb',1,'cv::cudev::operator*(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82ad067165475e005f75eb902cbcf2f6',1,'cv::cudev::operator*(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eca4d9d17555bb68127757943e54495',1,'cv::cudev::operator*(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddaa9f9bc413848a741a108556de7f66',1,'cv::cudev::operator*(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d937bc5dd036bbbc645b81f260b5b5',1,'cv::cudev::operator*(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3cce3391058528e77d01b2f2aaf28f4',1,'cv::cudev::operator*(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd32b6bf1571865c29d46f1ac091c5d',1,'cv::cudev::operator*(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09b06dc7f40394668ea338909fdb11da',1,'cv::cudev::operator*(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2561dcb50f1b343e79d929c85d9d6af2',1,'cv::cudev::operator*(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab96739276183d3d037db1b31b54f98cb',1,'cv::cudev::operator*(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bc8a2714623a07f6d32a01c5a02a19d',1,'cv::cudev::operator*(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e546e55ec80d5ce6e41dd72c8091ad7',1,'cv::cudev::operator*(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0f13827bf653baef99ce65166394e7f',1,'cv::cudev::operator*(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19620047188467d968634de432862b30',1,'cv::cudev::operator*(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9f8c286132b32a1d0d2f136b9304e9f',1,'cv::cudev::operator*(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89bebd81801426221358914f44b9399f',1,'cv::cudev::operator*(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad909b1577d5bc471b8ebc7d934253736',1,'cv::cudev::operator*(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ddea16553b01373469d460fd8f5f9',1,'cv::cudev::operator*(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd372b32bcd38be3dd4261d657c742fa',1,'cv::cudev::operator*(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e03853be024cf4a58640b575d7b6122',1,'cv::cudev::operator*(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b0ea30f8320cf30ca3b42aa699e1d11',1,'cv::cudev::operator*(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4976047aad73ae11f14d5311b5efc643',1,'cv::cudev::operator*(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d268df51117be47d5a192550113b2bb',1,'cv::cudev::operator*(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga886827c0f13b44c8fa578f3d4bab6187',1,'cv::cudev::operator*(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06546a623ef3a0292e0d0b5b9a241596',1,'cv::cudev::operator*(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f215d83712628eb64664ca8edc729c3',1,'cv::cudev::operator*(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322e5725d39b6a56b10217744fd54c84',1,'cv::cudev::operator*(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ca17de0407d90a3cac404220b157d5',1,'cv::cudev::operator*(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac169dc02de88236dc3287630549e7c32',1,'cv::cudev::operator*(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d60d4ea2cc22ce5ae0cf0950b2148dd',1,'cv::cudev::operator*(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95b4ecd54e292812be0faf0a93687fa5',1,'cv::cudev::operator*(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9246aa07ab9cb8d3a42db71f45d804a',1,'cv::cudev::operator*(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed19b40b852d4b05f7af20906f02df96',1,'cv::cudev::operator*(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa8c599bd31954a5687b8a1ae2ba1696',1,'cv::cudev::operator*(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ea6d03ee2c62f728d3fbfe71f16b259',1,'cv::cudev::operator*(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dabe0e00519ed1f069e7682e7dc28d2',1,'cv::cudev::operator*(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga916d16970792f1444932d3551460e762',1,'cv::cudev::operator*(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0acc20bf74d011ff6eb0263efa31c91',1,'cv::cudev::operator*(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacea516a696d7e15b81d71bc335a1be2b',1,'cv::cudev::operator*(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67e2f781ad85fbc5b4b2759018ef0bc',1,'cv::cudev::operator*(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cee4b43501cb0d54db315a9be3c00be',1,'cv::cudev::operator*(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eb8ba99e7883f7e5208da1d56a63ea8',1,'cv::cudev::operator*(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd127c751ea3d9b32c47a50503405eaa',1,'cv::cudev::operator*(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea8d0ec3ad321a074118524061e9de9b',1,'cv::cudev::operator*(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae972a64880e7f11f0b512bf4862c988d',1,'cv::cudev::operator*(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae7124c60811e471f4ccea775e6a8105',1,'cv::cudev::operator*(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefcfe41bdbb40358a627620664e43087',1,'cv::cudev::operator*(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga532206b6078098de41bdb7cdee843242',1,'cv::cudev::operator*(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6dde37f01013af843248fa57df5a4705',1,'cv::cudev::operator*(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d83c6f1c934d58b0db96fb9b1031e4',1,'cv::cudev::operator*(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0555787fcd7d58a8c94d0a4369c947',1,'cv::cudev::operator*(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5305d06b4d7893f8d4fb352f6941d49',1,'cv::cudev::operator*(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbccb0f7cfedd9faa5375d17e7acd9e6',1,'cv::cudev::operator*(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d713228fed5e4b46d913ee514c4702',1,'cv::cudev::operator*(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga416c75338bba0071cde9be85bdd14c8f',1,'cv::cudev::operator*(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c4bf653481daa71869c6ec80f7ac7c',1,'cv::cudev::operator*(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62bf09c0d8b2a28f9de71abb998ab55f',1,'cv::cudev::operator*(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e873b6129892d4d634e0b541aa5a356',1,'cv::cudev::operator*(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db9280a8455e340346203f8c8dbc45d',1,'cv::cudev::operator*(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bfdc89f82d9717003387c1d237f5923',1,'cv::cudev::operator*(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f86fba4880a36b6a7bd2394e161b34',1,'cv::cudev::operator*(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f952a21290dc2760de145e020239a6',1,'cv::cudev::operator*(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga530e3a25447a5113790059cf574c9d4d',1,'cv::cudev::operator*(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga939ac4107ae2ef44cdba119f11a3e41b',1,'cv::cudev::operator*(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa226675e3d5fa565377951e1fe2adf26',1,'cv::cudev::operator*(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga032a606b459e22962751c5b5cb56721c',1,'cv::cudev::operator*(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42182588882947c6d2ea60418ccfa53f',1,'cv::cudev::operator*(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657fd69c2c2dbaa5bbd8f38e9086600c',1,'cv::cudev::operator*(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga913025bdda9cfaf0a1d39fe6f912d32e',1,'cv::cudev::operator*(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcfcf7d4b858ae3c794028e7c55b20a',1,'cv::cudev::operator*(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b854a847e119bfbc02c2cc5de31787',1,'cv::cudev::operator*(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb615b962e904782d9555a089708366d',1,'cv::cudev::operator*(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b093cf980d6cabad1afbc4954ce86f9',1,'cv::cudev::operator*(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0613453550f4199c8fe8734f2e7ef4cb',1,'cv::cudev::operator*(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb4e9c2226edb173d19a520c69297f57',1,'cv::cudev::operator*(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a441729d11f327aa925f6980920c810',1,'cv::cudev::operator*(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c93c9c99656ffb2dcd5abda39efae1d',1,'cv::cudev::operator*(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b2fee3c015fbd9323b9951b595639f0',1,'cv::cudev::operator*(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1881d24ddb09d043dcd7c859e61b16',1,'cv::cudev::operator*(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c0fa10b8bed67d42ab55dc2208107f8',1,'cv::cudev::operator*(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga027915df6e568365ecfa3e12a5e677f4',1,'cv::cudev::operator*(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58bcfcef533a71a0a1a9ee50738d257c',1,'cv::cudev::operator*(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5920528b65944ed40e4497447d8e0316',1,'cv::cudev::operator*(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44418d16b815d5057b17b2a34246734c',1,'cv::cudev::operator*(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d29745317c743241a4d85cedc91bf88',1,'cv::cudev::operator*(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cbf71951b93eea0b5a076f7d18a7451',1,'cv::cudev::operator*(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e048d5a2db1da9b1575aebd01b047bb',1,'cv::cudev::operator*(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga663d40c6e2002f25c436d52d82b2c690',1,'cv::cudev::operator*(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7bd29f68c70d0a3b1b705f889140d0e',1,'cv::cudev::operator*(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4030fb67021c4472688f397dc551adb',1,'cv::cudev::operator*(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3476d190ac862ed33f50e5178938f6a',1,'cv::cudev::operator*(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04af26fcf72bcf1ea89a3406eb81dc56',1,'cv::cudev::operator*(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01861575c1321bb4e37ba4ff91b8f7dc',1,'cv::cudev::operator*(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9601e46278afcfaa677985f801a57d76',1,'cv::cudev::operator*(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab805b6e07f01115a8e08afa3108525',1,'cv::cudev::operator*(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a3751f548f681546118362181963dae',1,'cv::cudev::operator*(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8075bb13162203e07a2b9276b42aa063',1,'cv::cudev::operator*(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f7ee241d6ee1a6a20c735286770c6f',1,'cv::cudev::operator*(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga789c8bfcf46261d2c0c69901bfc53c61',1,'cv::cudev::operator*(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33a577374fa11cf0c7d9debceed5d70b',1,'cv::cudev::operator*(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab14d1e659db18b0c671ca9dbf9e0048f',1,'cv::cudev::operator*(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfad4cd4b1abf7ed115e9261d4fafaf1',1,'cv::cudev::operator*(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95434e47c47ea25a3a6d9f1906258286',1,'cv::cudev::operator*(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66aff7a10720233331180655c8be700d',1,'cv::cudev::operator*(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gac57f9a35a5d4d1d3ba23d7871113cbd3',1,'operator*(const Affine3< T > &affine1, const Affine3< T > &affine2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gae9c102e6fd783bcf801e3432aca22e7b',1,'operator*(const Affine3< T > &affine, const V &vector)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#ga548eb6a25623179405f13cad3954c01e',1,'operator*(const Affine3f &affine, const Vec3f &vector)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d0/de1/group__core.html#gaa607fd3c66c5c525cc4d39dc83ffd177',1,'operator*(const Affine3d &affine, const Vec3d &vector)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gab2ccc99b90013df8b9cf49f6c63842ff',1,'operator*(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gac2116f5bce2914d578953c6ac8c0da16',1,'operator*(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga902a09c161f9ef0eedcf1414e58f3672',1,'operator*(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487b453f9836d06d7324744d40dad0b',1,'operator*(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6515905db0f226f4645878f458e4ff9',1,'operator*(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf583d2c1fcd51d86094e1f30b2a58a2',1,'operator*(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e1bad5a79815eec73d07827b885d1cd',1,'operator*(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f79b898d0d82738072b4c49ef4086',1,'operator*(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5a0a9a53dee95c42e80578e6440b218',1,'operator*(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf27cecd7f8e200f4de479660583a8d15',1,'operator*(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7f8cfe1eaafe131a814ee152b9a6e5a',1,'operator*(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12aeb64e97cdb928290bf3fa82f05269',1,'operator*(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fa7f2aa7dd5048da167a76587a44028',1,'operator*(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93118d92ecb3c188a5c01ba769ba299e',1,'operator*(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f1a615302d17eda49ad2cec76c41859',1,'operator*(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca535315088057b26c801a5705c1483',1,'operator*(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510f2b0f9088282d3d47bf3093a38f78',1,'operator*(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga163edd6ad357b0a6b49d3ad55b84f88c',1,'operator*(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c75809716911fce2e047b0fb0c984b',1,'operator*(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9db0eb6fb6dacf76ef4e8c8c304ddd9c',1,'operator*(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b5811bca4633d9a78a6cae2adfa3dff',1,'operator*(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafda944b16459e9a69661d33e7607fb41',1,'operator*(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c7c955caf1909eb3c94363e1c7d3cb5',1,'operator*(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4aaeb25bb41c3e4d44a51b4930532426',1,'operator*(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43ee6bae7bda7ed2faf47b555790cb71',1,'operator*(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga02baabd5114aa4d102ed246afc6ce624',1,'operator*(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga090d742c550d7e79878be81be9bdb2d2',1,'operator*(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18a1ba838a8be508e64a43158cc45dfb',1,'operator*(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e14d050010ca7c994471bf8467e32d3',1,'operator*(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6d7b1523f9c29c8a05ad2e41f191a2fe',1,'operator*(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa1246b30b73eb70bba00a86fcd66395',1,'operator*(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ba88bd93ccad1c92db994fe051e342b',1,'operator*(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98f94ba39b97b682e67464d85209e95',1,'operator*(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84372ff1d3b6a2526b19964595096039',1,'operator*(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac3cc2c07d0405e5bef08000f75eb39e8',1,'operator*(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c697c1a0f04f6e63a5f9da4ac327e85',1,'operator*(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc87fb00c079b8edcfccd10ab13af8d2',1,'operator*(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf59a024579c49c38a26a8a27e58297c1',1,'operator*(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf912af0788d82a8d5aff820aaa99059',1,'operator*(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88c3308c7efb95649564d8be2691284d',1,'operator*(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb953af5f4125ba0182c6f8917300f90',1,'operator*(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac65246dd4280d78429ab84b3fc9c2870',1,'operator*(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f3e6aea5eb84905c559ef24412fa56',1,'operator*(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga414e54087adc42f28fa754230dbab979',1,'operator*(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac2d56a48c008a7e47b6310b109b376e',1,'operator*(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d7b82717c159efcaadead58ee8142a8',1,'operator*(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe5bfda78209600b7280b4bbd3cc3762',1,'operator*(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae528d51efc3d013a608832c80bed2f8c',1,'operator*(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga849d54a360b19427092bd7ce395da7c5',1,'operator*(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f187e66cff592d0712ceaaa605e038',1,'operator*(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaac0afe2a5142d8098d2482c3814f8671',1,'operator*(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5a08e2ac528655b1571f7fcb28c3c0',1,'operator*(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5333891f8e975c6bc4e8f5813545b4b',1,'operator*(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a3078c6a237576551f2d32606e32f10',1,'operator*(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ed7245cd9d9405b2de08c4b21fa08a5',1,'operator*(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc381907b598468405b30d25a06c8ff',1,'operator*(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e97c44127431ce49735fa92dbe4b25f',1,'operator*(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9424ca0c0b214254e9adecb61adb2e5a',1,'operator*(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae410ccbe1a6a58649302ccebf3c68949',1,'operator*(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3b2a2d0d9a613d056c8523e155b674c',1,'operator*(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85f5cd22ec760e4a2c14c78d80f4670d',1,'operator*(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37e9268a08593a1e1bb839e2ce50ede9',1,'operator*(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2429e2ed1796030785a93567ecf1776f',1,'operator*(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1c28bd26127b812ce97c907b32fc9fc',1,'operator*(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9cc4a289ee92829765bdf1958bc6e05',1,'operator*(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e8f6dbe9d17cbd6cf04375fc5fca9ae',1,'operator*(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f2fa27b61586fef88ab71db6e08faf0',1,'operator*(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cf9988841348e5856a943b777002e2b',1,'operator*(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38b8a526c1994b95e9ce76e3614acc86',1,'operator*(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23920ad7c06382a913e3fcf217459a0b',1,'operator*(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e9ba42884866db4b183e9028fd8b04f',1,'operator*(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf5b25603db42e2eb11c8fdd17a7f25f',1,'operator*(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c10d68845ebb0598810e51a2eba805c',1,'operator*(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65f2d1823549a4b6dc52ef6d3054ba56',1,'operator*(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1f3d4142ff834d438ef16a84fb23355',1,'operator*(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fcd3e4a9f5ffcb684e3945e713a190f',1,'operator*(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3caace9001357c38394f006fb1f634a',1,'operator*(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2076958e894ca52570151a2308d8c781',1,'operator*(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2741381920372f76817c4b9b76e28137',1,'operator*(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2394ee2867506f375e14a36018519d8a',1,'operator*(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6028638b717b193d90a9bbdd76a2797',1,'operator*(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf250948634b71efc0820d731faa6cda1',1,'operator*(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadc861ca7430feace92266e538ed54b24',1,'operator*(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08650b887f60c9a6c242c79f09c0cb69',1,'operator*(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5522c68d2ae330209abc2765d6b50992',1,'operator*(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacef4b96ed094bbed58d13a7071d1a87a',1,'operator*(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5bd92d93ed5dbf9714a033550a83ed',1,'operator*(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac18603d03fbcfdfd23751709f2238029',1,'operator*(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5afec7fb5b0492668e86c8181f441aa',1,'operator*(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2943f13db2702fddce4557a2e957c565',1,'operator*(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32454c9d98afba5f7144a92cd6bf5acb',1,'operator*(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16a1d022b4026918e85eaf28ac606a81',1,'operator*(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8c6dcb676ea367c9e1dd89fd4f0abf4',1,'operator*(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27de604fa033669bc0555199b31ef777',1,'operator*(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1edec141c59b8a684d2592d1420949a1',1,'operator*(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07a0d9f472b1baec9f5eabfff9d1eaf7',1,'operator*(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6be4a7723c490f8b150c714436100e12',1,'operator*(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddd96b00b4b034d26ce474707a4e5e1d',1,'operator*(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7ef727c5051a2421616f0517740d984',1,'operator*(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11b210a1793cf8e3d930c11dfda9ae6e',1,'operator*(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55db9f51fac5b573deb32220a631ca9',1,'operator*(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28a4888db08301e51da23d006f382653',1,'operator*(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7020c56e082be84fca69fa2c9916a4e',1,'operator*(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c25ca47380b7997200bb81a88f0323',1,'operator*(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7b92c373c28a5c4e44617cbbe8b28d8',1,'operator*(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dff9b27265d9a0d0b246618c2f6d190',1,'operator*(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e7e1c4649f286432072ebf0bbcaa069',1,'operator*(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98148cbe18fa5a1fe9cc37af9b2944da',1,'operator*(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8af39ddbfd14cda64dc1ea8312ddeaab',1,'operator*(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga25a1baeb7c9b07639b599dcafb0a7dd1',1,'operator*(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cfca580e4aed7f30b018f5b3b5f04de',1,'operator*(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28a09636e8ddc34502754ef3cc45736',1,'operator*(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd4d86a80e9a8ba4d0b8191946a7c7e4',1,'operator*(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga500f12286f4bde3313357ee9b77522d8',1,'operator*(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b1789f57a51f5db4560fe91f26bbd1',1,'operator*(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5723f7cf916b1c9455c8581abcdeb505',1,'operator*(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0e897f09e26316ca2aa0cbb965e1835',1,'operator*(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga314f5a0e14f5b478c6c979776c26d203',1,'operator*(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga819a0d444655998d3ae70cd93b283319',1,'operator*(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a5340751b48d6b199875c361804465',1,'operator*(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bce5ffd4058a6549f3bb651f50bfe46',1,'operator*(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ca0ada3b453db74593720374e9af90f',1,'operator*(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2228f02f69514b9ea9c3bd30df71d0',1,'operator*(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4f24178f4139fa88be47e2b9f7126eb',1,'operator*(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82ad067165475e005f75eb902cbcf2f6',1,'operator*(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eca4d9d17555bb68127757943e54495',1,'operator*(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddaa9f9bc413848a741a108556de7f66',1,'operator*(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d937bc5dd036bbbc645b81f260b5b5',1,'operator*(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3cce3391058528e77d01b2f2aaf28f4',1,'operator*(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd32b6bf1571865c29d46f1ac091c5d',1,'operator*(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09b06dc7f40394668ea338909fdb11da',1,'operator*(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2561dcb50f1b343e79d929c85d9d6af2',1,'operator*(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab96739276183d3d037db1b31b54f98cb',1,'operator*(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6bc8a2714623a07f6d32a01c5a02a19d',1,'operator*(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e546e55ec80d5ce6e41dd72c8091ad7',1,'operator*(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0f13827bf653baef99ce65166394e7f',1,'operator*(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19620047188467d968634de432862b30',1,'operator*(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac9f8c286132b32a1d0d2f136b9304e9f',1,'operator*(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89bebd81801426221358914f44b9399f',1,'operator*(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad909b1577d5bc471b8ebc7d934253736',1,'operator*(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae00ddea16553b01373469d460fd8f5f9',1,'operator*(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd372b32bcd38be3dd4261d657c742fa',1,'operator*(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e03853be024cf4a58640b575d7b6122',1,'operator*(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b0ea30f8320cf30ca3b42aa699e1d11',1,'operator*(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4976047aad73ae11f14d5311b5efc643',1,'operator*(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d268df51117be47d5a192550113b2bb',1,'operator*(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga886827c0f13b44c8fa578f3d4bab6187',1,'operator*(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06546a623ef3a0292e0d0b5b9a241596',1,'operator*(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f215d83712628eb64664ca8edc729c3',1,'operator*(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga322e5725d39b6a56b10217744fd54c84',1,'operator*(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9ca17de0407d90a3cac404220b157d5',1,'operator*(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac169dc02de88236dc3287630549e7c32',1,'operator*(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d60d4ea2cc22ce5ae0cf0950b2148dd',1,'operator*(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95b4ecd54e292812be0faf0a93687fa5',1,'operator*(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9246aa07ab9cb8d3a42db71f45d804a',1,'operator*(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed19b40b852d4b05f7af20906f02df96',1,'operator*(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa8c599bd31954a5687b8a1ae2ba1696',1,'operator*(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ea6d03ee2c62f728d3fbfe71f16b259',1,'operator*(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dabe0e00519ed1f069e7682e7dc28d2',1,'operator*(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga916d16970792f1444932d3551460e762',1,'operator*(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0acc20bf74d011ff6eb0263efa31c91',1,'operator*(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacea516a696d7e15b81d71bc335a1be2b',1,'operator*(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67e2f781ad85fbc5b4b2759018ef0bc',1,'operator*(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cee4b43501cb0d54db315a9be3c00be',1,'operator*(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eb8ba99e7883f7e5208da1d56a63ea8',1,'operator*(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd127c751ea3d9b32c47a50503405eaa',1,'operator*(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaea8d0ec3ad321a074118524061e9de9b',1,'operator*(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae972a64880e7f11f0b512bf4862c988d',1,'operator*(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae7124c60811e471f4ccea775e6a8105',1,'operator*(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefcfe41bdbb40358a627620664e43087',1,'operator*(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga532206b6078098de41bdb7cdee843242',1,'operator*(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6dde37f01013af843248fa57df5a4705',1,'operator*(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62d83c6f1c934d58b0db96fb9b1031e4',1,'operator*(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0555787fcd7d58a8c94d0a4369c947',1,'operator*(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5305d06b4d7893f8d4fb352f6941d49',1,'operator*(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbccb0f7cfedd9faa5375d17e7acd9e6',1,'operator*(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d713228fed5e4b46d913ee514c4702',1,'operator*(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga416c75338bba0071cde9be85bdd14c8f',1,'operator*(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c4bf653481daa71869c6ec80f7ac7c',1,'operator*(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62bf09c0d8b2a28f9de71abb998ab55f',1,'operator*(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e873b6129892d4d634e0b541aa5a356',1,'operator*(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7db9280a8455e340346203f8c8dbc45d',1,'operator*(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8bfdc89f82d9717003387c1d237f5923',1,'operator*(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58f86fba4880a36b6a7bd2394e161b34',1,'operator*(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8f952a21290dc2760de145e020239a6',1,'operator*(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga530e3a25447a5113790059cf574c9d4d',1,'operator*(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga939ac4107ae2ef44cdba119f11a3e41b',1,'operator*(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa226675e3d5fa565377951e1fe2adf26',1,'operator*(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga032a606b459e22962751c5b5cb56721c',1,'operator*(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42182588882947c6d2ea60418ccfa53f',1,'operator*(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657fd69c2c2dbaa5bbd8f38e9086600c',1,'operator*(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga913025bdda9cfaf0a1d39fe6f912d32e',1,'operator*(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcfcf7d4b858ae3c794028e7c55b20a',1,'operator*(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b854a847e119bfbc02c2cc5de31787',1,'operator*(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb615b962e904782d9555a089708366d',1,'operator*(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b093cf980d6cabad1afbc4954ce86f9',1,'operator*(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0613453550f4199c8fe8734f2e7ef4cb',1,'operator*(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb4e9c2226edb173d19a520c69297f57',1,'operator*(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a441729d11f327aa925f6980920c810',1,'operator*(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c93c9c99656ffb2dcd5abda39efae1d',1,'operator*(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b2fee3c015fbd9323b9951b595639f0',1,'operator*(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1881d24ddb09d043dcd7c859e61b16',1,'operator*(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c0fa10b8bed67d42ab55dc2208107f8',1,'operator*(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga027915df6e568365ecfa3e12a5e677f4',1,'operator*(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58bcfcef533a71a0a1a9ee50738d257c',1,'operator*(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5920528b65944ed40e4497447d8e0316',1,'operator*(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44418d16b815d5057b17b2a34246734c',1,'operator*(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d29745317c743241a4d85cedc91bf88',1,'operator*(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cbf71951b93eea0b5a076f7d18a7451',1,'operator*(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e048d5a2db1da9b1575aebd01b047bb',1,'operator*(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga663d40c6e2002f25c436d52d82b2c690',1,'operator*(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7bd29f68c70d0a3b1b705f889140d0e',1,'operator*(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4030fb67021c4472688f397dc551adb',1,'operator*(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3476d190ac862ed33f50e5178938f6a',1,'operator*(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04af26fcf72bcf1ea89a3406eb81dc56',1,'operator*(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01861575c1321bb4e37ba4ff91b8f7dc',1,'operator*(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9601e46278afcfaa677985f801a57d76',1,'operator*(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab805b6e07f01115a8e08afa3108525',1,'operator*(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a3751f548f681546118362181963dae',1,'operator*(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8075bb13162203e07a2b9276b42aa063',1,'operator*(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f7ee241d6ee1a6a20c735286770c6f',1,'operator*(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga789c8bfcf46261d2c0c69901bfc53c61',1,'operator*(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33a577374fa11cf0c7d9debceed5d70b',1,'operator*(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab14d1e659db18b0c671ca9dbf9e0048f',1,'operator*(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfad4cd4b1abf7ed115e9261d4fafaf1',1,'operator*(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95434e47c47ea25a3a6d9f1906258286',1,'operator*(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66aff7a10720233331180655c8be700d',1,'operator*(double s, const double4 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga198533c477a87a54b78d348778d6a246',1,'std::operator*(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gadcae3a7fb5244e221cbab5efb79b56c4',1,'std::operator*(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga410ff39982a7970454bfe8e1ce7ddcf7',1,'std::operator*(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga198533c477a87a54b78d348778d6a246',1,'operator*(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gadcae3a7fb5244e221cbab5efb79b56c4',1,'operator*(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga410ff39982a7970454bfe8e1ce7ddcf7',1,'operator*(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#ad225313de8037d40c2d26c17edf1a9fd',1,'Eigen::operator*(const InverseImpl< PermutationType, PermutationStorage > &tperm, const SparseMatrixBase< SparseDerived > &matrix)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a9723b3ff0f2c99fe1081e3eb14380d4c',1,'Eigen::operator*(const MatrixBase< MatrixDerived > &matrix, const PermutationBase< PermutationDerived > &permutation)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a06ca1e6b1a30b4dd0f2633664fe4d956',1,'Eigen::operator*(const MatrixBase< MatrixDerived > &matrix, const TranspositionsBase< TranspositionsDerived > &transpositions)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a634bfd5e206a2e77f799b4c3956ea49e',1,'Eigen::operator*(const MatrixBase< OtherDerived > &other, const HouseholderSequence< VectorsType, CoeffsType, Side > &h)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a02fbb1bbd915b899b34a56a3cd64c438',1,'Eigen::operator*(const PermutationBase< PermDerived > &perm, const SparseMatrixBase< SparseDerived > &matrix)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a4d2abe28092f8070e971494c7e0b507a',1,'Eigen::operator*(const PermutationBase< PermutationDerived > &permutation, const MatrixBase< MatrixDerived > &matrix)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a8b7051d2f98498d619044089949f931d',1,'Eigen::operator*(const SparseMatrixBase< SparseDerived > &matrix, const InverseImpl< PermutationType, PermutationStorage > &tperm)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a429958a0e6bd27168f3935d3100c55cf',1,'Eigen::operator*(const SparseMatrixBase< SparseDerived > &matrix, const PermutationBase< PermDerived > &perm)'],['https://eigen.tuxfamily.org/dox/namespaceEigen.html#a02b783ce2d2464d4f4a0bc0d1dc494f0',1,'Eigen::operator*(const TranspositionsBase< TranspositionsDerived > &transpositions, const MatrixBase< MatrixDerived > &matrix)']]], + ['operator_2a_3d_106',['operator*=',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'cv::Matx::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< _Tp, cn, 1 >::operator*=(Matx< _Tp, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 1, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 2 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 2, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 3 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 3, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, 4, 4 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< double, cn, 1 >::operator*=(Matx< double, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 2, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, 3, 3 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float, cn, 1 >::operator*=(Matx< float, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#ab7d2fcfafe7be7c992746435a70cb5e6',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, int alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a8570101df25bc81d1c86ec71c55d3a70',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, float alpha)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a758df4032a73ab3edd89ab7ba027632e',1,'Matx< float_type, 4, 4 >::operator*=(Matx< float_type, m, n > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadfb86357bfb8cd27685582d3b7bb49ab',1,'cv::softdouble::operator*=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga412ec9d48b6f525b0ca44cfe4a2f12f9',1,'cv::softfloat::operator*=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'cv::Vec::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'cv::Vec::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'cv::Vec::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< _Tp, 4 >::operator*=(Vec< _Tp, 4 > &v1, const Vec< _Tp, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 2 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 2 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 2 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 3 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 3 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 3 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 4 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, 4 >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, 4 >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< double, nFeatures >::operator*=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< double, nFeatures >::operator*=(Vec< double, 4 > &v1, const Vec< double, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 2 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 2 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 2 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 3 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a042d09a8bb9649c097cbf9dcd17bb40d',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a0a649fce0da8da1cfeb4942ea7455a80',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3d8c6f0f19967d3386c9f0a4c04317d4',1,'Vec< float, 3 >::operator*=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a8de712b940c85e830987a40f10ab19d1',1,'Vec< float, 3 >::operator*=(Vec< float, 4 > &v1, const Vec< float, 4 > &v2)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga7bb2f4f7a2db97ebfa07181ba6435d1a',1,'std::complex::operator*=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaa495c7cb0718149e6a34650bc5ec4e1',1,'std::complex::operator*=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga84520c24cc0701e3f2bbeaea755e4aa2',1,'std::gslice_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac530f41a625a6f0842fc4fda0cb98189',1,'std::indirect_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga1878d8ab7ea54a42bbd783172af8a8c2',1,'std::mask_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2ae66c8e0229b65881780cb0dbd55ef8',1,'std::slice_array::operator*=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga345cd13171b5d52efb4979a1b3930ea6',1,'std::valarray::operator*=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab5a419c3673c284962634894e9c1fc20',1,'std::valarray::operator*=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga345cd13171b5d52efb4979a1b3930ea6',1,'valarray< size_t >::operator*=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab5a419c3673c284962634894e9c1fc20',1,'valarray< size_t >::operator*=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a6a5ff80e9d85106a1c9958219961c21d',1,'Eigen::ArrayBase::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a6a5ff80e9d85106a1c9958219961c21d',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3783b6168995ca117a1c19fea3630ac4',1,'Eigen::MatrixBase::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3783b6168995ca117a1c19fea3630ac4',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a3783b6168995ca117a1c19fea3630ac4',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'Eigen::QuaternionBase::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#afd8ee6b6420fbdd22fab7cd016212441',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a84fd39c79d4ca547ef0ff6c3c1dfcfcb',1,'Eigen::Rotation2D::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#adb13b29d664962dc3f62551644f11e87',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'Eigen::VectorwiseOp::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Derived, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Derived, Vertical >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator*=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#acef518a77a8947c6726ba30d56dd67cb',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator*=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gae3a0bf0a7afa1dd2d3f4390220fd0934',1,'cv::operator*=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga412ec9d48b6f525b0ca44cfe4a2f12f9',1,'operator*=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadfb86357bfb8cd27685582d3b7bb49ab',1,'operator*=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gae3a0bf0a7afa1dd2d3f4390220fd0934',1,'operator*=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga7bb2f4f7a2db97ebfa07181ba6435d1a',1,'operator*=(const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaa495c7cb0718149e6a34650bc5ec4e1',1,'operator*=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga84520c24cc0701e3f2bbeaea755e4aa2',1,'operator*=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga345cd13171b5d52efb4979a1b3930ea6',1,'operator*=(const _Tp &)(Global Namespace)']]], + ['operator_2b_107',['operator+',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a366cabf9cd5b9a9fb0e313570c5b3cac',1,'cv::MatExpr::operator+(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a93d7d34c3f0b5dbc5d6171d0a0094f28',1,'cv::MatExpr::operator+(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aefc08124af851c90433c85f39fb63a7e',1,'cv::MatExpr::operator+(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a503c5fe1e1f66590b35969fc28ba1af7',1,'cv::MatExpr::operator+(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab866e1c69c03008f2f9c0d923c4dc861',1,'cv::MatExpr::operator+(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a65604e00ecb411bef65e3c668a4bdf63',1,'cv::MatExpr::operator+(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac9b4c182fe91d94500d290beb8098345',1,'cv::MatExpr::operator+(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4f77f0a2048840246c7f219c5a06f2ff',1,'cv::MatExpr::operator+(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5d74e36027bfe69b2a50c7d5cc53752b',1,'cv::MatExpr::operator+(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9694cf1e4e9fe627f8b701cb9f97f2d0',1,'cv::MatExpr::operator+(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a366cabf9cd5b9a9fb0e313570c5b3cac',1,'cv::MatExpr::operator+(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a93d7d34c3f0b5dbc5d6171d0a0094f28',1,'cv::MatExpr::operator+(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aefc08124af851c90433c85f39fb63a7e',1,'cv::MatExpr::operator+(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a503c5fe1e1f66590b35969fc28ba1af7',1,'cv::MatExpr::operator+(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab866e1c69c03008f2f9c0d923c4dc861',1,'cv::MatExpr::operator+(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a65604e00ecb411bef65e3c668a4bdf63',1,'cv::MatExpr::operator+(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac9b4c182fe91d94500d290beb8098345',1,'cv::MatExpr::operator+(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4f77f0a2048840246c7f219c5a06f2ff',1,'cv::MatExpr::operator+(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5d74e36027bfe69b2a50c7d5cc53752b',1,'cv::MatExpr::operator+(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9694cf1e4e9fe627f8b701cb9f97f2d0',1,'cv::MatExpr::operator+(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'cv::Matx::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'cv::Matx::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< _Tp, cn, 1 >::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< _Tp, cn, 1 >::operator+(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 1, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 1, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 2 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 2 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 2, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 3 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 3, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 4, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, 4, 4 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, cn, 1 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< double, cn, 1 >::operator+(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 2, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 2, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 3, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, 3, 3 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, cn, 1 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float, cn, 1 >::operator+(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float_type, 4, 4 >::operator+(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a0acac01a6f4e811b6e593fcd9145c096',1,'Matx< float_type, 4, 4 >::operator+(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gacf49831e844a094b21a41a37df2189e8',1,'cv::softdouble::operator+()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadb3c3fbb5bf49638bcaeddbfd16f3df7',1,'cv::softfloat::operator+()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'cv::Vec::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'cv::Vec::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< _Tp, 4 >::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< _Tp, 4 >::operator+(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 2 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 2 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 3 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 3 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 4 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, 4 >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< double, nFeatures >::operator+(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 2 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 2 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 3 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a769ac1790f96e7fba1155af5c0a54d4a',1,'Vec< float, 3 >::operator+(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a6719627d8f502c54e16f321d1790e030',1,'std::fpos::operator+()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a936c0491dbd3dfadfdbee626478b7009',1,'std::reverse_iterator::operator+()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga33a3a90827549220500c99f95b095816',1,'std::valarray::operator+()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga33a3a90827549220500c99f95b095816',1,'valarray< size_t >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'Eigen::VectorwiseOp::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Derived, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Derived, Vertical >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator+()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a713694459d81b76e4f2a78e4d169f8d6',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator+()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga9d4eb51e74c435420686e52b53d915a0',1,'cv::operator+()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga385a1836312404fd848a8f74b8ad7864',1,'cv::cudev::operator+(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0564f5e1dc7986e8b367e5e18d628cf9',1,'cv::cudev::operator+(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5751f0f9eea09af7d7be1a7ff9a6419',1,'cv::cudev::operator+(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4926bad3815b360be75781d8f789a299',1,'cv::cudev::operator+(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487522cfe2377387f941eb27b11052f0',1,'cv::cudev::operator+(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5318bd8d2d748d2c2f2e85cfa83f4174',1,'cv::cudev::operator+(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a593b2d7e5a664703a3189cfa3e8a2b',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga401671318958313b03cab9656be10333',1,'cv::cudev::operator+(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34588ecb09ba0f5b8bce1932b71ac2dc',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab32742b4d82dacbf5b03c3caaa21ad6a',1,'cv::cudev::operator+(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb808a69e62713677618f7e6aa6bad1c',1,'cv::cudev::operator+(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e85ea3a9090037ad78ba58f8d0635d1',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa545ec34a0a8d0b6b566d40d6b06be4',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88558d974e34b06012625b059582f84f',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ef3164d983c6c208fa7eae2d04e4901',1,'cv::cudev::operator+(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00e830af93185b0b0d9254abb4a3ba25',1,'cv::cudev::operator+(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga360059063d9c94f6895ad04c5538caa2',1,'cv::cudev::operator+(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab09d02dd9ae9cba4fff849e8cb4f011b',1,'cv::cudev::operator+(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaee9d8126772df36af785513ee3f33a0',1,'cv::cudev::operator+(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7809d9f6135f58240496734783a0d8e7',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa48ac783fc4d8c222edc3a5fee93d08',1,'cv::cudev::operator+(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1413eaa25988525f32e8b0c38588aca4',1,'cv::cudev::operator+(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31142062b4480b36487e1ceaf5001c60',1,'cv::cudev::operator+(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657e5172dce9285cd3450207c231ba91',1,'cv::cudev::operator+(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c965673b83d820595742fcba9d84ae6',1,'cv::cudev::operator+(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c140fc976d1e3b806105fbc841c5c8b',1,'cv::cudev::operator+(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87375c057e8e240da0620c8d30375fae',1,'cv::cudev::operator+(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f396374a8c6eaab38c438aa19f61953',1,'cv::cudev::operator+(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafadeec24b1b0d32d74f4bf66913a4961',1,'cv::cudev::operator+(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4626d73f4a41498ea009b0405b6fc58',1,'cv::cudev::operator+(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafec18ef79d72a4abcb395b55fa950ecc',1,'cv::cudev::operator+(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd70100577469c4b17877014098c321c',1,'cv::cudev::operator+(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga070cddd435b54d39dd9f53202de91e70',1,'cv::cudev::operator+(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65c78b19985aebe50cff55cb91091cb5',1,'cv::cudev::operator+(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a8be678d5c6d59577d013b1bc0f659a',1,'cv::cudev::operator+(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad505ddfe2b0b2efd85712ee4ee151ee',1,'cv::cudev::operator+(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa716696f351b72ed62b2eb9298e92431',1,'cv::cudev::operator+(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24687bb3a3f43d4cf77051b7f61c5bb5',1,'cv::cudev::operator+(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286f2da548b65f5e52a36f3a0c1b6e72',1,'cv::cudev::operator+(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e7d1a9a90ccd15a67db5330d206d39',1,'cv::cudev::operator+(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdc537c7585647e3c6244b9ff20a0f8c',1,'cv::cudev::operator+(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ad4f702de359a5fc1a9ae0f7e8a675b',1,'cv::cudev::operator+(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac437623c5a924fb1f5ec76555bd9349c',1,'cv::cudev::operator+(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09c0474800254c2fe5df7078b22f0c4',1,'cv::cudev::operator+(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5f3e910fc0bfac66f7b492dfaffa89d',1,'cv::cudev::operator+(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc384f8555e474bf0b42ba3294efbbe',1,'cv::cudev::operator+(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga230f38bc05d616d730d39e284de2a572',1,'cv::cudev::operator+(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ea72be29807fa7a5e3e125bb28ae1da',1,'cv::cudev::operator+(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095e7b638083196b19aa23f0fefb7f8',1,'cv::cudev::operator+(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbbd16fd0445cc803b551cefccee7d84',1,'cv::cudev::operator+(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a507070ee180987e572c027ad63720',1,'cv::cudev::operator+(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c8c57cb603e887926b3ef02d1b1f60f',1,'cv::cudev::operator+(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga751771b8771fc49355177eec0a0c7d11',1,'cv::cudev::operator+(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38a48c26d465ac5004500358a3be3fce',1,'cv::cudev::operator+(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e50479d44fef2f0af1d8bde6e6be5ad',1,'cv::cudev::operator+(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d63e7a7da37c059ee00217e3ab7e4f5',1,'cv::cudev::operator+(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a5a7ffefbe42e9de70da5fa44e0ea4',1,'cv::cudev::operator+(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69524132efa29c8fc980d6064a5c4fe1',1,'cv::cudev::operator+(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84f6e2fa384a11c09c186bf90f942305',1,'cv::cudev::operator+(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9634185808bd5543bffebed158218603',1,'cv::cudev::operator+(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a6f9277eb1d9b4ad95fb976f74be75',1,'cv::cudev::operator+(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1603e29ec853a1114e2fb0815a51ea14',1,'cv::cudev::operator+(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0f4f24948f8a31dd58c7504e95ae',1,'cv::cudev::operator+(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97fa01c350fde8c17cf70e4a665b42b6',1,'cv::cudev::operator+(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fafcdc8062ddf5b9a78cae00c698bec',1,'cv::cudev::operator+(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1fd6fc4c1d59c4d53aa036558028249',1,'cv::cudev::operator+(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd40aac024e1bcaf8023c2e35ced21c1',1,'cv::cudev::operator+(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695049876ddf039f3165e81de036bedf',1,'cv::cudev::operator+(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b80304249a375b80a8ecc267010063c',1,'cv::cudev::operator+(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa15da58a45f9288fb35d6f8804d748c9',1,'cv::cudev::operator+(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2dc62a33db896daaa413d6ea63511cb',1,'cv::cudev::operator+(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d432caa595a9d4e640a86c17dc87b33',1,'cv::cudev::operator+(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecb6ed173735a3e47a133011930bf170',1,'cv::cudev::operator+(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e20dbff7f2045ab3c4be9470646731',1,'cv::cudev::operator+(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89417add04bd126c8f349fc38e0be984',1,'cv::cudev::operator+(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f625b502a1cce9022de0c517a258989',1,'cv::cudev::operator+(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c24ef33bcb0428c76d9000d0c2dda7',1,'cv::cudev::operator+(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b2125e71b80c7fbed85a25428e4c3ce',1,'cv::cudev::operator+(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf25af14c9fafc45956d1531db11144ec',1,'cv::cudev::operator+(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e4c43d9bd3c9baf188b342a11cb6c92',1,'cv::cudev::operator+(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbe87e48c185c1c553f1781c8e51a78b',1,'cv::cudev::operator+(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a9afd18666cabaaff2b5bc1c6953c3d',1,'cv::cudev::operator+(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d6cd004ebf0046d8d05ce58be122e81',1,'cv::cudev::operator+(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf1559bb0b4711ff843e1f8689b0a21b',1,'cv::cudev::operator+(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9722a56f762fd4695dba0a6f581f993a',1,'cv::cudev::operator+(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf855f9f25f4366fe40e26fe92a193707',1,'cv::cudev::operator+(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadedbaa5bcb6aa88fcbbb08af9a056f23',1,'cv::cudev::operator+(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d7795a199307f39f05a7a52b7de164',1,'cv::cudev::operator+(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga491957d2d9dfc406352ab6f9e8c1483e',1,'cv::cudev::operator+(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac82a73e58ad54a045e3d6f90d4f00e91',1,'cv::cudev::operator+(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5509c565962e42b79b574ad682fd5044',1,'cv::cudev::operator+(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27dfa9b51f3a3aef1cbb1e874a1ebb17',1,'cv::cudev::operator+(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd8c880d85625a11bbbe05dea82e01ef',1,'cv::cudev::operator+(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc977b3f2a65f34876a461d9f8518a0f',1,'cv::cudev::operator+(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9be7290ae6342d75ea634d0b164f1ff9',1,'cv::cudev::operator+(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c8f90f6f825fb29b485ffe50390bf9a',1,'cv::cudev::operator+(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0244726591afd293c8228ce596639a63',1,'cv::cudev::operator+(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b851bb2cf578a6c6fe7ef7f02231fa3',1,'cv::cudev::operator+(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac08b7d9bbd26916b5650d4c95cedfdf1',1,'cv::cudev::operator+(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga617aa0c6e7b5bab86edfba469189b518',1,'cv::cudev::operator+(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c8b32a9eb67e145f7e8e6a4f58ee446',1,'cv::cudev::operator+(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa78824f70ed6aff53a468ba69721b940',1,'cv::cudev::operator+(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133f66972b269764ee2ee346366e86f8',1,'cv::cudev::operator+(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf1feb32c0186aa799348a619b15d492',1,'cv::cudev::operator+(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd42be9af8cc02f9ef351bbfead86e9',1,'cv::cudev::operator+(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac578dbae14068cab12ed2474c3d4c26c',1,'cv::cudev::operator+(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaead47ecf6a982cd89d2bd0e641b3b7de',1,'cv::cudev::operator+(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad410367422b6d4613cd9b3267ba698ad',1,'cv::cudev::operator+(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec447276ee554fbeadb63b05ad85816d',1,'cv::cudev::operator+(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac50f4daaf1949b1ef02de731dd4ddf65',1,'cv::cudev::operator+(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bde0cbb5805451c231fdad81908f849',1,'cv::cudev::operator+(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3085b3839365b0059cf1d31f19a63e3b',1,'cv::cudev::operator+(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55869a964cfdd901e7f67148a2e7d39',1,'cv::cudev::operator+(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbe668aec66b824c71e9cedb3e81b476',1,'cv::cudev::operator+(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c65960614e3da3a1c84780c344fff3',1,'cv::cudev::operator+(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f012e7f890a1d981c451c061b18da4f',1,'cv::cudev::operator+(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5bc69c6f65a3267d86c10e9427e50b3',1,'cv::cudev::operator+(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32eb280bd3436219f82bd7749046ce95',1,'cv::cudev::operator+(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa38542588a556bd21f1a3965b23d8d7e',1,'cv::cudev::operator+(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d06cbe3afb88ccc14d64cfa586ebfd',1,'cv::cudev::operator+(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e2e78e19bf1e54a3e764c47de16439',1,'cv::cudev::operator+(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga705b07f251d4e2c6a1d387e47fb0ebbf',1,'cv::cudev::operator+(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ef44a2d91c634e28cb3b493e1f6c9e9',1,'cv::cudev::operator+(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c7ee9b5737344bec6da2ffa4e0131b9',1,'cv::cudev::operator+(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61a7a96d326eace5a635e011cb2c76de',1,'cv::cudev::operator+(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8e25981380ec4e29c96d742e16f4caf',1,'cv::cudev::operator+(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69182858edbcfc754983f725faed9caf',1,'cv::cudev::operator+(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58a0aa4ac62f9368f026cc9cae4ab27c',1,'cv::cudev::operator+(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4932125e3fb3d43e988f20d98c92088a',1,'cv::cudev::operator+(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80481ef157cd534a7917db2c17806e11',1,'cv::cudev::operator+(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1945ac3f9acb340d56b2a123b56e2b6',1,'cv::cudev::operator+(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cda29304020b62ea1023d4c78357da9',1,'cv::cudev::operator+(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3890c98225ce81b7a9563dcadcbaa726',1,'cv::cudev::operator+(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2729c40733ac42bc9d8e8f22515d280b',1,'cv::cudev::operator+(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga815dd0dd7f2c53d35d474093f4f280a5',1,'cv::cudev::operator+(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f87c194094f4b225e01acc41ab4794c',1,'cv::cudev::operator+(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2935ebf4613c634864ae4604a27887ac',1,'cv::cudev::operator+(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cf666905454d84b149ae1f48d67bcc7',1,'cv::cudev::operator+(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedaaa885c3e387fcd8a57556223aa7a6',1,'cv::cudev::operator+(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab897af788ef49fe0a09832df944d61df',1,'cv::cudev::operator+(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b4ee5d82e458102eeab773243ea035',1,'cv::cudev::operator+(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5661c7cb9979d6cc95e98a6b324f3027',1,'cv::cudev::operator+(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga215e0e32a513cc0a9d870aa2af9f8563',1,'cv::cudev::operator+(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66d278c2d4206520854c7bf1ccfe0f71',1,'cv::cudev::operator+(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22d7acef9c458758b9938b5c16ecf1a6',1,'cv::cudev::operator+(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c186b379a335e9c0934a7558d7ab6f',1,'cv::cudev::operator+(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa575be0a6a9b80ba0400783ee96172ff',1,'cv::cudev::operator+(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04e953ca224c70e9a2b72a2b32f2cbfd',1,'cv::cudev::operator+(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e63aa7508890f5fc5fe74de963be45',1,'cv::cudev::operator+(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b64430c28f9c83e524066f22576c72c',1,'cv::cudev::operator+(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2807cdcc4a5d60ad709603abceac15',1,'cv::cudev::operator+(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6843246a6684565e67ed25c20c26b274',1,'cv::cudev::operator+(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0d509dbc5cc5eca3f74d25bf58dc55f',1,'cv::cudev::operator+(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac178c31b30000975ec5f66528b8729cd',1,'cv::cudev::operator+(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd5263d626e5688f4eea2edab7d3181f',1,'cv::cudev::operator+(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101de5c53f41c316a19a38dae5b117fe',1,'cv::cudev::operator+(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf58403ff9e23b6cee2516093cd97591e',1,'cv::cudev::operator+(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa185dbf1eb74efb51f3c5b3df4a9779',1,'cv::cudev::operator+(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1ba272cc5c9a2e39be16e19d70f2b0f',1,'cv::cudev::operator+(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af6b3a5e6fae8011628bcba8f730fe6',1,'cv::cudev::operator+(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bea5e892ad256972784f4f242e238a6',1,'cv::cudev::operator+(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34e88270476eaec6947195ac65632fb3',1,'cv::cudev::operator+(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc25f8350d7b49e877a5056c01b0d3a',1,'cv::cudev::operator+(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49bb3b73cfc2d3814000189184c152e7',1,'cv::cudev::operator+(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b58436ecb19bfa8164de7f990262b3c',1,'cv::cudev::operator+(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2032e800d832a8073d0dc2faef8a2dcd',1,'cv::cudev::operator+(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cef590a05e646cd57f77e6ee0be2d54',1,'cv::cudev::operator+(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb7eb522b0b7eb2799e015cfa8b74f53',1,'cv::cudev::operator+(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2af58cde3e25ca7ac04bcf1f55b52b52',1,'cv::cudev::operator+(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9317db3a8d728e6cfa073f4d57f21451',1,'cv::cudev::operator+(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22fdf93a0c8baf015b0d4b3b2cae8647',1,'cv::cudev::operator+(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b86c6d7c58b0794918765f9c1b839b',1,'cv::cudev::operator+(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eb912d94c68c7c592a8abd305d70aa1',1,'cv::cudev::operator+(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0188cf93b31b6d645c8f34f3992acde',1,'cv::cudev::operator+(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa95c038dfcd6f3375fd02c768ad735',1,'cv::cudev::operator+(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72cbd50d5d37be4e5174a68c21197617',1,'cv::cudev::operator+(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb87110c2951164d19f445969b076e96',1,'cv::cudev::operator+(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3e30731dbc17b3371d8017ccecd7d8b',1,'cv::cudev::operator+(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee5ba2d0674493e83ef9f46c19d01780',1,'cv::cudev::operator+(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab720a95ea55112441355a03963e8cb33',1,'cv::cudev::operator+(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03459898b7324f26de2388149ab4405',1,'cv::cudev::operator+(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c6f1db356d455ca3a7f71e81b43c6cb',1,'cv::cudev::operator+(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b4fd2d02f582f3f5c3071a157733fef',1,'cv::cudev::operator+(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73ac7a1964fb9064b94b7000ae14b06c',1,'cv::cudev::operator+(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c37d85d76f27f899a71677bf2c87965',1,'cv::cudev::operator+(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad67577fc0a303c66c31bb1cf11f072f4',1,'cv::cudev::operator+(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga463d44e45ae112517e69b59e5c05d2a2',1,'cv::cudev::operator+(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d45696a36817a7e03096ccb93efd678',1,'cv::cudev::operator+(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab881ab61562effcbdfb223834615cf9b',1,'cv::cudev::operator+(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845975ac0aa7a6e6ebcc6a0a5ccd1c6d',1,'cv::cudev::operator+(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ba4d696f23852287e920f9e39edbbc',1,'cv::cudev::operator+(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32199ebd017e38ef320461f564645fb1',1,'cv::cudev::operator+(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a277011ea76600e79758badd705b678',1,'cv::cudev::operator+(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab43588987ff4b565dff1496dcd93ceae',1,'cv::cudev::operator+(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4152033d3851f97c38b771e239265f04',1,'cv::cudev::operator+(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d988af531245304baa08913efeb0640',1,'cv::cudev::operator+(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10081f4c12a23d7b318423b00c0db522',1,'cv::cudev::operator+(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247ce351637b9c0b52f4915a7d2c4f6b',1,'cv::cudev::operator+(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a268a36253f07ca021dcebfee47ad10',1,'cv::cudev::operator+(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bbe87b038e1f5206c9d675104f91641',1,'cv::cudev::operator+(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab21b3162568bd7ae01f795a239f30ae5',1,'cv::cudev::operator+(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f3015dbf9a8bfebccee4ff5f8f0a13',1,'cv::cudev::operator+(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15d13e591d5ee6826542214b0b74046d',1,'cv::cudev::operator+(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e4033519a3535d8a458fb00ebee1559',1,'cv::cudev::operator+(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931953ada1dffe875beabe1f8f7bd030',1,'cv::cudev::operator+(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f610a053e45fa3c16c26b8fdac93563',1,'cv::cudev::operator+(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ff42a78160f10c832b89c2a7164e9ed',1,'cv::cudev::operator+(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c92678779773f7e36cbb585aff566f',1,'cv::cudev::operator+(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22ace1eefc87813ef769f102b0b3769d',1,'cv::cudev::operator+(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4814b6e72f311d414e0850c0b06ff2c8',1,'cv::cudev::operator+(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b9b43b4642e35d27d7ac6daaae1cf1a',1,'cv::cudev::operator+(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfe6d281caa0fcb744e38d8bca4c8d10',1,'cv::cudev::operator+(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb868810dbd9f370826a464fbfd6b63a',1,'cv::cudev::operator+(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafca4bacae455e2b15d9120d3495dd896',1,'cv::cudev::operator+(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc478dda6bd01bc954b9c52305187699',1,'cv::cudev::operator+(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf711eec1f4565f53cc5b24ffb4a65913',1,'cv::cudev::operator+(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4a1f5111573c3bd3ecfd696a6de505',1,'cv::cudev::operator+(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c4d7c3df7d674b9ff59c463173a1af5',1,'cv::cudev::operator+(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b48c6860baafe07388ea2d096ea63a8',1,'cv::cudev::operator+(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81619ea66499b085d6230361d755efd1',1,'cv::cudev::operator+(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4abcffbca6e6949ee898f486b7e74862',1,'cv::cudev::operator+(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f85134d8553add116bd4111d710dfe6',1,'cv::cudev::operator+(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a5b0f36ca97b7681786abe433e95225',1,'cv::cudev::operator+(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bca16e176bdf04054bf50edd8434825',1,'cv::cudev::operator+(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadb3c3fbb5bf49638bcaeddbfd16f3df7',1,'operator+(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gacf49831e844a094b21a41a37df2189e8',1,'operator+(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga9d4eb51e74c435420686e52b53d915a0',1,'operator+(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga385a1836312404fd848a8f74b8ad7864',1,'operator+(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0564f5e1dc7986e8b367e5e18d628cf9',1,'operator+(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5751f0f9eea09af7d7be1a7ff9a6419',1,'operator+(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4926bad3815b360be75781d8f789a299',1,'operator+(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga487522cfe2377387f941eb27b11052f0',1,'operator+(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5318bd8d2d748d2c2f2e85cfa83f4174',1,'operator+(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a593b2d7e5a664703a3189cfa3e8a2b',1,'operator+(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga401671318958313b03cab9656be10333',1,'operator+(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34588ecb09ba0f5b8bce1932b71ac2dc',1,'operator+(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab32742b4d82dacbf5b03c3caaa21ad6a',1,'operator+(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb808a69e62713677618f7e6aa6bad1c',1,'operator+(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e85ea3a9090037ad78ba58f8d0635d1',1,'operator+(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa545ec34a0a8d0b6b566d40d6b06be4',1,'operator+(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88558d974e34b06012625b059582f84f',1,'operator+(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ef3164d983c6c208fa7eae2d04e4901',1,'operator+(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00e830af93185b0b0d9254abb4a3ba25',1,'operator+(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga360059063d9c94f6895ad04c5538caa2',1,'operator+(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab09d02dd9ae9cba4fff849e8cb4f011b',1,'operator+(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaee9d8126772df36af785513ee3f33a0',1,'operator+(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7809d9f6135f58240496734783a0d8e7',1,'operator+(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa48ac783fc4d8c222edc3a5fee93d08',1,'operator+(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1413eaa25988525f32e8b0c38588aca4',1,'operator+(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31142062b4480b36487e1ceaf5001c60',1,'operator+(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657e5172dce9285cd3450207c231ba91',1,'operator+(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c965673b83d820595742fcba9d84ae6',1,'operator+(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c140fc976d1e3b806105fbc841c5c8b',1,'operator+(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87375c057e8e240da0620c8d30375fae',1,'operator+(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f396374a8c6eaab38c438aa19f61953',1,'operator+(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafadeec24b1b0d32d74f4bf66913a4961',1,'operator+(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa4626d73f4a41498ea009b0405b6fc58',1,'operator+(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafec18ef79d72a4abcb395b55fa950ecc',1,'operator+(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd70100577469c4b17877014098c321c',1,'operator+(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga070cddd435b54d39dd9f53202de91e70',1,'operator+(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65c78b19985aebe50cff55cb91091cb5',1,'operator+(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a8be678d5c6d59577d013b1bc0f659a',1,'operator+(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaad505ddfe2b0b2efd85712ee4ee151ee',1,'operator+(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa716696f351b72ed62b2eb9298e92431',1,'operator+(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24687bb3a3f43d4cf77051b7f61c5bb5',1,'operator+(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286f2da548b65f5e52a36f3a0c1b6e72',1,'operator+(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e7d1a9a90ccd15a67db5330d206d39',1,'operator+(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdc537c7585647e3c6244b9ff20a0f8c',1,'operator+(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ad4f702de359a5fc1a9ae0f7e8a675b',1,'operator+(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac437623c5a924fb1f5ec76555bd9349c',1,'operator+(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09c0474800254c2fe5df7078b22f0c4',1,'operator+(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5f3e910fc0bfac66f7b492dfaffa89d',1,'operator+(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dc384f8555e474bf0b42ba3294efbbe',1,'operator+(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga230f38bc05d616d730d39e284de2a572',1,'operator+(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ea72be29807fa7a5e3e125bb28ae1da',1,'operator+(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae095e7b638083196b19aa23f0fefb7f8',1,'operator+(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbbd16fd0445cc803b551cefccee7d84',1,'operator+(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74a507070ee180987e572c027ad63720',1,'operator+(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c8c57cb603e887926b3ef02d1b1f60f',1,'operator+(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga751771b8771fc49355177eec0a0c7d11',1,'operator+(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga38a48c26d465ac5004500358a3be3fce',1,'operator+(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e50479d44fef2f0af1d8bde6e6be5ad',1,'operator+(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d63e7a7da37c059ee00217e3ab7e4f5',1,'operator+(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72a5a7ffefbe42e9de70da5fa44e0ea4',1,'operator+(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69524132efa29c8fc980d6064a5c4fe1',1,'operator+(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84f6e2fa384a11c09c186bf90f942305',1,'operator+(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9634185808bd5543bffebed158218603',1,'operator+(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a6f9277eb1d9b4ad95fb976f74be75',1,'operator+(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1603e29ec853a1114e2fb0815a51ea14',1,'operator+(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0f4f24948f8a31dd58c7504e95ae',1,'operator+(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97fa01c350fde8c17cf70e4a665b42b6',1,'operator+(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fafcdc8062ddf5b9a78cae00c698bec',1,'operator+(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1fd6fc4c1d59c4d53aa036558028249',1,'operator+(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd40aac024e1bcaf8023c2e35ced21c1',1,'operator+(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga695049876ddf039f3165e81de036bedf',1,'operator+(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b80304249a375b80a8ecc267010063c',1,'operator+(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa15da58a45f9288fb35d6f8804d748c9',1,'operator+(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2dc62a33db896daaa413d6ea63511cb',1,'operator+(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d432caa595a9d4e640a86c17dc87b33',1,'operator+(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecb6ed173735a3e47a133011930bf170',1,'operator+(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e20dbff7f2045ab3c4be9470646731',1,'operator+(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89417add04bd126c8f349fc38e0be984',1,'operator+(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f625b502a1cce9022de0c517a258989',1,'operator+(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c24ef33bcb0428c76d9000d0c2dda7',1,'operator+(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b2125e71b80c7fbed85a25428e4c3ce',1,'operator+(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf25af14c9fafc45956d1531db11144ec',1,'operator+(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e4c43d9bd3c9baf188b342a11cb6c92',1,'operator+(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafbe87e48c185c1c553f1781c8e51a78b',1,'operator+(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a9afd18666cabaaff2b5bc1c6953c3d',1,'operator+(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d6cd004ebf0046d8d05ce58be122e81',1,'operator+(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf1559bb0b4711ff843e1f8689b0a21b',1,'operator+(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9722a56f762fd4695dba0a6f581f993a',1,'operator+(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf855f9f25f4366fe40e26fe92a193707',1,'operator+(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadedbaa5bcb6aa88fcbbb08af9a056f23',1,'operator+(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12d7795a199307f39f05a7a52b7de164',1,'operator+(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga491957d2d9dfc406352ab6f9e8c1483e',1,'operator+(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac82a73e58ad54a045e3d6f90d4f00e91',1,'operator+(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5509c565962e42b79b574ad682fd5044',1,'operator+(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27dfa9b51f3a3aef1cbb1e874a1ebb17',1,'operator+(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd8c880d85625a11bbbe05dea82e01ef',1,'operator+(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc977b3f2a65f34876a461d9f8518a0f',1,'operator+(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9be7290ae6342d75ea634d0b164f1ff9',1,'operator+(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c8f90f6f825fb29b485ffe50390bf9a',1,'operator+(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0244726591afd293c8228ce596639a63',1,'operator+(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b851bb2cf578a6c6fe7ef7f02231fa3',1,'operator+(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac08b7d9bbd26916b5650d4c95cedfdf1',1,'operator+(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga617aa0c6e7b5bab86edfba469189b518',1,'operator+(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c8b32a9eb67e145f7e8e6a4f58ee446',1,'operator+(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa78824f70ed6aff53a468ba69721b940',1,'operator+(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133f66972b269764ee2ee346366e86f8',1,'operator+(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf1feb32c0186aa799348a619b15d492',1,'operator+(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd42be9af8cc02f9ef351bbfead86e9',1,'operator+(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac578dbae14068cab12ed2474c3d4c26c',1,'operator+(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaead47ecf6a982cd89d2bd0e641b3b7de',1,'operator+(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad410367422b6d4613cd9b3267ba698ad',1,'operator+(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec447276ee554fbeadb63b05ad85816d',1,'operator+(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac50f4daaf1949b1ef02de731dd4ddf65',1,'operator+(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bde0cbb5805451c231fdad81908f849',1,'operator+(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3085b3839365b0059cf1d31f19a63e3b',1,'operator+(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf55869a964cfdd901e7f67148a2e7d39',1,'operator+(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbe668aec66b824c71e9cedb3e81b476',1,'operator+(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c65960614e3da3a1c84780c344fff3',1,'operator+(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f012e7f890a1d981c451c061b18da4f',1,'operator+(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5bc69c6f65a3267d86c10e9427e50b3',1,'operator+(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32eb280bd3436219f82bd7749046ce95',1,'operator+(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa38542588a556bd21f1a3965b23d8d7e',1,'operator+(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7d06cbe3afb88ccc14d64cfa586ebfd',1,'operator+(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e2e78e19bf1e54a3e764c47de16439',1,'operator+(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga705b07f251d4e2c6a1d387e47fb0ebbf',1,'operator+(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ef44a2d91c634e28cb3b493e1f6c9e9',1,'operator+(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c7ee9b5737344bec6da2ffa4e0131b9',1,'operator+(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61a7a96d326eace5a635e011cb2c76de',1,'operator+(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf8e25981380ec4e29c96d742e16f4caf',1,'operator+(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga69182858edbcfc754983f725faed9caf',1,'operator+(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58a0aa4ac62f9368f026cc9cae4ab27c',1,'operator+(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4932125e3fb3d43e988f20d98c92088a',1,'operator+(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80481ef157cd534a7917db2c17806e11',1,'operator+(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1945ac3f9acb340d56b2a123b56e2b6',1,'operator+(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cda29304020b62ea1023d4c78357da9',1,'operator+(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3890c98225ce81b7a9563dcadcbaa726',1,'operator+(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2729c40733ac42bc9d8e8f22515d280b',1,'operator+(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga815dd0dd7f2c53d35d474093f4f280a5',1,'operator+(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f87c194094f4b225e01acc41ab4794c',1,'operator+(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2935ebf4613c634864ae4604a27887ac',1,'operator+(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cf666905454d84b149ae1f48d67bcc7',1,'operator+(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedaaa885c3e387fcd8a57556223aa7a6',1,'operator+(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab897af788ef49fe0a09832df944d61df',1,'operator+(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8b4ee5d82e458102eeab773243ea035',1,'operator+(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5661c7cb9979d6cc95e98a6b324f3027',1,'operator+(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga215e0e32a513cc0a9d870aa2af9f8563',1,'operator+(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66d278c2d4206520854c7bf1ccfe0f71',1,'operator+(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22d7acef9c458758b9938b5c16ecf1a6',1,'operator+(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7c186b379a335e9c0934a7558d7ab6f',1,'operator+(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa575be0a6a9b80ba0400783ee96172ff',1,'operator+(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04e953ca224c70e9a2b72a2b32f2cbfd',1,'operator+(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e63aa7508890f5fc5fe74de963be45',1,'operator+(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b64430c28f9c83e524066f22576c72c',1,'operator+(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2807cdcc4a5d60ad709603abceac15',1,'operator+(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6843246a6684565e67ed25c20c26b274',1,'operator+(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0d509dbc5cc5eca3f74d25bf58dc55f',1,'operator+(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac178c31b30000975ec5f66528b8729cd',1,'operator+(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd5263d626e5688f4eea2edab7d3181f',1,'operator+(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101de5c53f41c316a19a38dae5b117fe',1,'operator+(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf58403ff9e23b6cee2516093cd97591e',1,'operator+(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa185dbf1eb74efb51f3c5b3df4a9779',1,'operator+(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1ba272cc5c9a2e39be16e19d70f2b0f',1,'operator+(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4af6b3a5e6fae8011628bcba8f730fe6',1,'operator+(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0bea5e892ad256972784f4f242e238a6',1,'operator+(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34e88270476eaec6947195ac65632fb3',1,'operator+(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc25f8350d7b49e877a5056c01b0d3a',1,'operator+(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49bb3b73cfc2d3814000189184c152e7',1,'operator+(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b58436ecb19bfa8164de7f990262b3c',1,'operator+(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2032e800d832a8073d0dc2faef8a2dcd',1,'operator+(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cef590a05e646cd57f77e6ee0be2d54',1,'operator+(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb7eb522b0b7eb2799e015cfa8b74f53',1,'operator+(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2af58cde3e25ca7ac04bcf1f55b52b52',1,'operator+(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9317db3a8d728e6cfa073f4d57f21451',1,'operator+(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22fdf93a0c8baf015b0d4b3b2cae8647',1,'operator+(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b86c6d7c58b0794918765f9c1b839b',1,'operator+(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eb912d94c68c7c592a8abd305d70aa1',1,'operator+(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0188cf93b31b6d645c8f34f3992acde',1,'operator+(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa95c038dfcd6f3375fd02c768ad735',1,'operator+(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72cbd50d5d37be4e5174a68c21197617',1,'operator+(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb87110c2951164d19f445969b076e96',1,'operator+(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3e30731dbc17b3371d8017ccecd7d8b',1,'operator+(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee5ba2d0674493e83ef9f46c19d01780',1,'operator+(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab720a95ea55112441355a03963e8cb33',1,'operator+(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad03459898b7324f26de2388149ab4405',1,'operator+(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c6f1db356d455ca3a7f71e81b43c6cb',1,'operator+(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b4fd2d02f582f3f5c3071a157733fef',1,'operator+(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73ac7a1964fb9064b94b7000ae14b06c',1,'operator+(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c37d85d76f27f899a71677bf2c87965',1,'operator+(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad67577fc0a303c66c31bb1cf11f072f4',1,'operator+(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga463d44e45ae112517e69b59e5c05d2a2',1,'operator+(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d45696a36817a7e03096ccb93efd678',1,'operator+(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab881ab61562effcbdfb223834615cf9b',1,'operator+(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845975ac0aa7a6e6ebcc6a0a5ccd1c6d',1,'operator+(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9ba4d696f23852287e920f9e39edbbc',1,'operator+(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32199ebd017e38ef320461f564645fb1',1,'operator+(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a277011ea76600e79758badd705b678',1,'operator+(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab43588987ff4b565dff1496dcd93ceae',1,'operator+(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4152033d3851f97c38b771e239265f04',1,'operator+(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d988af531245304baa08913efeb0640',1,'operator+(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10081f4c12a23d7b318423b00c0db522',1,'operator+(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247ce351637b9c0b52f4915a7d2c4f6b',1,'operator+(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a268a36253f07ca021dcebfee47ad10',1,'operator+(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bbe87b038e1f5206c9d675104f91641',1,'operator+(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab21b3162568bd7ae01f795a239f30ae5',1,'operator+(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f3015dbf9a8bfebccee4ff5f8f0a13',1,'operator+(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15d13e591d5ee6826542214b0b74046d',1,'operator+(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e4033519a3535d8a458fb00ebee1559',1,'operator+(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931953ada1dffe875beabe1f8f7bd030',1,'operator+(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f610a053e45fa3c16c26b8fdac93563',1,'operator+(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ff42a78160f10c832b89c2a7164e9ed',1,'operator+(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09c92678779773f7e36cbb585aff566f',1,'operator+(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22ace1eefc87813ef769f102b0b3769d',1,'operator+(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4814b6e72f311d414e0850c0b06ff2c8',1,'operator+(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b9b43b4642e35d27d7ac6daaae1cf1a',1,'operator+(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfe6d281caa0fcb744e38d8bca4c8d10',1,'operator+(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb868810dbd9f370826a464fbfd6b63a',1,'operator+(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafca4bacae455e2b15d9120d3495dd896',1,'operator+(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc478dda6bd01bc954b9c52305187699',1,'operator+(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf711eec1f4565f53cc5b24ffb4a65913',1,'operator+(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4a1f5111573c3bd3ecfd696a6de505',1,'operator+(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c4d7c3df7d674b9ff59c463173a1af5',1,'operator+(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b48c6860baafe07388ea2d096ea63a8',1,'operator+(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81619ea66499b085d6230361d755efd1',1,'operator+(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4abcffbca6e6949ee898f486b7e74862',1,'operator+(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f85134d8553add116bd4111d710dfe6',1,'operator+(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a5b0f36ca97b7681786abe433e95225',1,'operator+(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bca16e176bdf04054bf50edd8434825',1,'operator+(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a7e943cfd42382fe2fcba3fd5b4fc1476',1,'__gnu_cxx::operator+(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ab2b89b39ac900719a3a14e634ec860a5',1,'__gnu_cxx::operator+(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#acc9338b2661112c05017dbdeb21df9c7',1,'__gnu_cxx::operator+(_CharT __lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ab0f3593c273db1a2619a43db92c66efe',1,'__gnu_cxx::operator+(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a72c2b3659c31815c11e1d6b1a1d7e924',1,'__gnu_cxx::operator+(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, _CharT __rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gafa26cb16064a2b5197bfa440c98bdd95',1,'std::operator+(const complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a31fffa82cc0872d928c7d11371c34c49',1,'std::operator+(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ae220860a64ea80fb9522daf38053aa8f',1,'std::operator+(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a952b727c802635e947a9a6b64f2f3ed1',1,'std::operator+(_CharT __lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7ba297cc435f21d90383baeebae8652c',1,'std::operator+(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa8298429823127738ccdf0b66e07249e',1,'std::operator+(const basic_string< _CharT, _Traits, _Alloc > &__lhs, _CharT __rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gada3d19f6d35799895239d9d8da91b874',1,'std::operator+(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaaa550f4048e573f92e2fbfae0ce8eab',1,'std::operator+(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga0bc80c123fa74e604e7d598b7e2b3a50',1,'std::operator+(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gafa26cb16064a2b5197bfa440c98bdd95',1,'operator+(const complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gada3d19f6d35799895239d9d8da91b874',1,'operator+(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaaaa550f4048e573f92e2fbfae0ce8eab',1,'operator+(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga0bc80c123fa74e604e7d598b7e2b3a50',1,'operator+(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga33a3a90827549220500c99f95b095816',1,'operator+() const(Global Namespace)']]], + ['operator_2b_2b_108',['operator++',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a6a06cf1a5b94057476a925f3f758c490',1,'cv::FileNodeIterator::operator++()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a4daed1197209314a7a9bada1cb21af53',1,'cv::FileNodeIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a70052c25251e3387d8ab80d86febef95',1,'cv::LineIterator::operator++()'],['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a79c1edcfb30865c5abec03e48f91bcdc',1,'cv::LineIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a7f30a14ed656e99d0297fb028316d23a',1,'cv::MatConstIterator::operator++()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a9ee1e96236b15dcadf6d383db272b49e',1,'cv::MatConstIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ae079204d24a71cbadf489e2a7be4fd17',1,'cv::MatConstIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#a04b79539dc9788dd44ffe41dc737f008',1,'cv::MatConstIterator_::operator++(int)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a164083b962b0b7ac8df36e9a90a4fab1',1,'cv::MatIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a3046b334bfa46d6cb19596fe552b4eb9',1,'cv::MatIterator_::operator++(int)'],['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a3e686d47da475b75c9b8ec11723bb2f3',1,'cv::NAryMatIterator::operator++()'],['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a260701f031521ebeac69bcc35c02a0d9',1,'cv::NAryMatIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ad72bcf02305bcfcd92d4006621225fbd',1,'cv::SparseMatConstIterator::operator++()'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ac18bf0568c460ed4a3c652348ef3f6a8',1,'cv::SparseMatConstIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a6c4e03aa55423633e9b7ba5df92530f0',1,'cv::SparseMatConstIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#a2a1bbc3e0dcbdd3a08a89397bfad38ee',1,'cv::SparseMatConstIterator_::operator++(int)'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a8685211cc25d171aa9687847a76406c0',1,'cv::SparseMatIterator::operator++()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#aa89c17982bf2f3d1057d2bc09d36462b',1,'cv::SparseMatIterator::operator++(int)'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#a5dd3f1223ff101fd63a670102e1a805c',1,'cv::SparseMatIterator_::operator++()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#af5357404aa31635fe16fb7900c24e990',1,'cv::SparseMatIterator_::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#af083e59c576b9e4f483df16b7411c10f',1,'__gnu_debug::_Safe_iterator::operator++() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a0e18ec08b2e93621558f7ba5ced2dda6',1,'__gnu_debug::_Safe_iterator::operator++(int) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#ae86d3f9ac2f797a9231fb441c3a85f04',1,'__gnu_debug::_Safe_local_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a970d20722ad94a43afaa2e4db289f85e',1,'__gnu_debug::_Safe_local_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09579.html#ab5ee82c060324ccc10d02831a5270a7c',1,'__gnu_parallel::_GuardedIterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#af083e59c576b9e4f483df16b7411c10f',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator++() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a0e18ec08b2e93621558f7ba5ced2dda6',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator++(int) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#af083e59c576b9e4f483df16b7411c10f',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator++() noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a0e18ec08b2e93621558f7ba5ced2dda6',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator++(int) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#aabeb7276d4ce2366c5bb6c9a9f213546',1,'const_iterator_::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12091.html#abb2e9ec96985b4c74418481ebb6e47e1',1,'const_iterator_::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#ae3ce4e8d7eab45011fa177454aecf378',1,'iterator_::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#ad5a05ab49fce8dd1c5eb8b807f0d84f5',1,'iterator_::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#a86e4cf04673011aa38c843b3eb44e2f8',1,'std::back_insert_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#ad9e4589271dccb8b64df10af255d4076',1,'std::back_insert_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#aac63c27293526bf0b0c4d4a2472ba785',1,'std::front_insert_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#a0bb8e39402c65287d891388eaea27c8b',1,'std::front_insert_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a66d30004d7402c9067fa8faadd7b8861',1,'std::insert_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a1d81a713bb24ef57aba0ce6dba2a84f0',1,'std::insert_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#a4c45d7bfc4e2a3594fb8918017b4ac3a',1,'std::istreambuf_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02483.html#adb987d5d42a928df600f5068d8a9e1dc',1,'std::istreambuf_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ad925d614752b837a7147d44d322a6aad',1,'std::ostreambuf_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#a0e9d282823cd7811717ad6bd890f8626',1,'std::ostreambuf_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#af1cd40b1c657b09254c830a6db8bd207',1,'std::regex_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a5cc20a645b74551c5130c8740fe96d9e',1,'std::regex_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a7d7768b8573112a25b0f2a567fd2b72c',1,'std::regex_token_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a699a85d3f9aed40a35d338596b8b2f9e',1,'std::regex_token_iterator::operator++(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a785ca20b14ac95ee033695423ecf1d53',1,'std::reverse_iterator::operator++()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a27c37221dec91844c7a72cb9dc28441d',1,'std::reverse_iterator::operator++(int)']]], + ['operator_2b_3d_109',['operator+=',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a77b08ee6b326b9d83ed01de4b30930d2',1,'cv::FileNodeIterator::operator+=()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a52fbb4c870f2c7678c29d892cf8f8307',1,'cv::MatConstIterator::operator+=()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ae423bce6d88387faeb59c63a818b7627',1,'cv::MatConstIterator_::operator+=()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a3bc7e3002fdda7346c15a455352673b2',1,'cv::MatIterator_::operator+=()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'cv::Matx::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'cv::Matx::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< _Tp, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< _Tp, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 1, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 1, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 2 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 2 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 3, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< double, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 2, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, 3, 3 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float, cn, 1 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float_type, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a7731f5b2caea69ec7ec478bcf4a0ec55',1,'Matx< float_type, 4, 4 >::operator+=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c429977f1b260829de0a009f8105029',1,'cv::softdouble::operator+=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga478a5a673e3131fbfd1c7a357f878023',1,'cv::softfloat::operator+=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'cv::Vec::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'cv::Vec::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< _Tp, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< _Tp, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, 4 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< double, nFeatures >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 2 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#aa28fdeaf53664464c58293c6e0426d8b',1,'Vec< float, 3 >::operator+=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a4b8715fc8f6a53505b98b9b19b512453',1,'__gnu_cxx::__versa_string::operator+=(const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a79d20017299bbfc786b2d5540e5af61d',1,'__gnu_cxx::__versa_string::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ac14c7143cc1a4ed1ad31593b4a8da43b',1,'__gnu_cxx::__versa_string::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a1a409030e39ba995df18fefc38525c2a',1,'__gnu_cxx::__versa_string::operator+=(std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'__gnu_debug::basic_string::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< _CharT >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< _CharT >::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< _CharT >::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< _CharT >::operator+=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< _CharT, _Traits, _Allocator >::operator+=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(_Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator+=(initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< char >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< char >::operator+=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< char >::operator+=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< char >::operator+=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator+=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< char_type, _Traits, _Alloc >::operator+=(initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'basic_string< value_type >::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'basic_string< value_type >::operator+=(const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'basic_string< value_type >::operator+=(value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'basic_string< value_type >::operator+=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a3f985c5b2f4e7220ca0f49fba85ee836',1,'std::basic_string::operator+=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#adbefaa945be40d2d60d200370327f078',1,'std::basic_string::operator+=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a8795b7445dab8726bfdf3e7ad7bfd45b',1,'std::basic_string::operator+=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a44f1139d68b80d8dfb0920903d5542c4',1,'std::basic_string::operator+=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a1994cceaeac8896749a47d2d61e6754f',1,'std::complex::operator+=(const _Tp &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gabf4797890e21e8f0f05b3a73aa215395',1,'std::complex::operator+=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a82884338bf22e5b2e47088240ee3603c',1,'std::fpos::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadaedde83c0c3dc087cd28fede7547179',1,'std::gslice_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaeb7b9d2b39d2312c117a50769114e26c',1,'std::indirect_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga3cd7a0e7c02e60936993f2f8d85d7e14',1,'std::mask_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a2060fd42f847719055e4b416650824ea',1,'std::reverse_iterator::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gabffb22fe7508d7fb6b06e4ca76440fc0',1,'std::slice_array::operator+=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga75cc5c668aaade5ccc50b199d789e191',1,'std::valarray::operator+=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8b82cbb5b9eafa8c1fc86ae8678e1f36',1,'std::valarray::operator+=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga75cc5c668aaade5ccc50b199d789e191',1,'valarray< size_t >::operator+=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8b82cbb5b9eafa8c1fc86ae8678e1f36',1,'valarray< size_t >::operator+=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a9cc9fdb4d0d6eb80a45107b86aacbfed',1,'Eigen::ArrayBase::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a9cc9fdb4d0d6eb80a45107b86aacbfed',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a983cc3be0bbe11b3d041a415b76ce010',1,'Eigen::MatrixBase::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a983cc3be0bbe11b3d041a415b76ce010',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a983cc3be0bbe11b3d041a415b76ce010',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a1d2edf8ab80733b8b2620d8c2a3100d3',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'Eigen::VectorwiseOp::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Derived, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Derived, Vertical >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator+=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a23ce2522d11c3362ca22252b2876812b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator+=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a40226d9c84fcb9cb948ae0c27b842c57.html#a40226d9c84fcb9cb948ae0c27b842c57',1,'nlohmann::basic_json::operator+=(basic_json &&val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_af643a4baa91f484b11af0e4437183115.html#af643a4baa91f484b11af0e4437183115',1,'nlohmann::basic_json::operator+=(const basic_json &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ae300819781bce2193369609457f70f30.html#ae300819781bce2193369609457f70f30',1,'nlohmann::basic_json::operator+=(const typename object_t::value_type &val)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ac48302a8b4f8c2a6e30c2a7bff6abc49.html#ac48302a8b4f8c2a6e30c2a7bff6abc49',1,'nlohmann::basic_json::operator+=(initializer_list_t init)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1decb593e539029ba11c6fcc72c969cd',1,'cv::operator+=()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ab8d1fddfb94e88c939838e006e23e295',1,'cv::gapi::own::operator+=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga478a5a673e3131fbfd1c7a357f878023',1,'operator+=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga5c429977f1b260829de0a009f8105029',1,'operator+=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1decb593e539029ba11c6fcc72c969cd',1,'operator+=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gabf4797890e21e8f0f05b3a73aa215395',1,'operator+=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadaedde83c0c3dc087cd28fede7547179',1,'operator+=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga75cc5c668aaade5ccc50b199d789e191',1,'operator+=(const _Tp &)(Global Namespace)']]], + ['operator_2c_110',['operator,',['https://docs.opencv.org/4.2.0/d6/d9e/classcv_1_1MatCommaInitializer__.html#a769e50401811af082c9e7fe51b7f5e7c',1,'cv::MatCommaInitializer_::operator,()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a76d12259ac3602278c8082f5fdbc9cec',1,'cv::MatxCommaInitializer::operator,()'],['https://docs.opencv.org/4.2.0/d0/d92/classcv_1_1MatxCommaInitializer.html#a76d12259ac3602278c8082f5fdbc9cec',1,'MatxCommaInitializer< _Tp, m, 1 >::operator,()'],['https://docs.opencv.org/4.2.0/d1/d3e/classcv_1_1VecCommaInitializer.html#ad458955e9c77d81d8078d28e3444dcdf',1,'cv::VecCommaInitializer::operator,()']]], + ['operator_2d_111',['operator-',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a4ec58573be20ff741b7f4d21bc223635',1,'cv::FileNodeIterator::operator-(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a4ec58573be20ff741b7f4d21bc223635',1,'cv::FileNodeIterator::operator-(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae07cd7b4ce3474dbdb1a264e2f6e7b0d',1,'cv::MatExpr::operator-(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad424f126a496afadafb4b6c67a1ce174',1,'cv::MatExpr::operator-(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6ed1d63630a0498bae02e4a71e757342',1,'cv::MatExpr::operator-(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a268e1ccaa369123adf2215756e3fae6a',1,'cv::MatExpr::operator-(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad7a022ce69ea48d8d9110cb79ab27b6a',1,'cv::MatExpr::operator-(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab851dfc040860bcf008d19e4a5926b83',1,'cv::MatExpr::operator-(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0d1940f6e797fb5f8092db30db875bdf',1,'cv::MatExpr::operator-(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a881069f5bff2833f6319cf2e7769fdbe',1,'cv::MatExpr::operator-(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaacefdef37dffe5d5214939666fce32f',1,'cv::MatExpr::operator-(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a3e8db9cfa032043f31d40211508653b1',1,'cv::MatExpr::operator-(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a22ebbe4ce388179e64afe917fa369003',1,'cv::MatExpr::operator-(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a09f773558b48e56dfa061179599e11d0',1,'cv::MatExpr::operator-(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae07cd7b4ce3474dbdb1a264e2f6e7b0d',1,'cv::MatExpr::operator-(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad424f126a496afadafb4b6c67a1ce174',1,'cv::MatExpr::operator-(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6ed1d63630a0498bae02e4a71e757342',1,'cv::MatExpr::operator-(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a268e1ccaa369123adf2215756e3fae6a',1,'cv::MatExpr::operator-(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ad7a022ce69ea48d8d9110cb79ab27b6a',1,'cv::MatExpr::operator-(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab851dfc040860bcf008d19e4a5926b83',1,'cv::MatExpr::operator-(const MatExpr &e, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0d1940f6e797fb5f8092db30db875bdf',1,'cv::MatExpr::operator-(const Scalar &s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a881069f5bff2833f6319cf2e7769fdbe',1,'cv::MatExpr::operator-(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aaacefdef37dffe5d5214939666fce32f',1,'cv::MatExpr::operator-(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a3e8db9cfa032043f31d40211508653b1',1,'cv::MatExpr::operator-(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a22ebbe4ce388179e64afe917fa369003',1,'cv::MatExpr::operator-(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a09f773558b48e56dfa061179599e11d0',1,'cv::MatExpr::operator-(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'cv::Matx::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< _Tp, cn, 1 >::operator-(const Matx< _Tp, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 1, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 2 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 2, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 3 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 3, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, 4, 4 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< double, cn, 1 >::operator-(const Matx< double, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 2, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, 3, 3 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float, cn, 1 >::operator-(const Matx< float, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a1cae966ac2a36de66db53723ff5061ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a70b0ff0245ad1c22139cac5d62c3c0ab',1,'Matx< float_type, 4, 4 >::operator-(const Matx< float_type, m, n > &a)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf6a12deaeedcf12e67dc695caff1068',1,'cv::softdouble::operator-(const softdouble &) const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga8150a63cd7bd61db576f3d89082e8b5d',1,'cv::softdouble::operator-() const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga00fec559cf58adaedb43c5092df36b84',1,'cv::softfloat::operator-(const softfloat &) const'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6d151a3faa03d866700dd46f0ad04a',1,'cv::softfloat::operator-() const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'cv::Vec::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a, const Vec< _Tp, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< _Tp, 4 >::operator-(const Vec< _Tp, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 2 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 3 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, 4 >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a, const Vec< double, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< double, nFeatures >::operator-(const Vec< double, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 2 >::operator-(const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a489b5f7e8d5589d1da7244205818a7df',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a, const Vec< float, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a346e0bf2c89e494aaf80c6f8ba4f5417',1,'Vec< float, 3 >::operator-(const Vec< float, cn > &a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#af2e0577cdf823db2436ffc2c3e5bf5d5',1,'std::fpos::operator-(streamoff __off) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#a9cb8084ee1bb8395c4a5e7a937092425',1,'std::fpos::operator-(const fpos &__other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a3942515868778c8f04f5b34fd78d1fce',1,'std::reverse_iterator::operator-()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga028b49a6d0cf1f6afa48149603d953b2',1,'std::valarray::operator-()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga028b49a6d0cf1f6afa48149603d953b2',1,'valarray< size_t >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'Eigen::VectorwiseOp::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Derived, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Derived, Vertical >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator-()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a5e60616620df132d665b301bb9a304c4',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator-()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga657904e675f20f6b84d7821cf1b02576',1,'cv::operator-()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5c17b1b5b5fe0b3b4e8e5bd32cbf72b',1,'cv::cudev::operator-(const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8218dac34f71c38487a697ea52557259',1,'cv::cudev::operator-(const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga369f1d0d8d3803abcc6e10bf145d4edd',1,'cv::cudev::operator-(const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cccd86250a11d8e232198edf4251f14',1,'cv::cudev::operator-(const Expr< Body > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafcebc509ca2a96c5b80ab1b96926b5c',1,'cv::cudev::operator-(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32e53e6cd3aa0aec01a90c11008c5a',1,'cv::cudev::operator-(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa812557e00bb932af910630701a2e6d5',1,'cv::cudev::operator-(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga212b4e512e56d38893b3d94109f19e5a',1,'cv::cudev::operator-(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga923d4bc9a45182d9ff86558f8c3b3e1a',1,'cv::cudev::operator-(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf43079f133408f0dd329fa6f1d316f34',1,'cv::cudev::operator-(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5400e7e698ff6fb2a8e8eb929b71e818',1,'cv::cudev::operator-(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07f833d814ae15aa1f7f06fc72285d71',1,'cv::cudev::operator-(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630122d5ecd56ab75dc7a740237d4277',1,'cv::cudev::operator-(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga589105db257ea2341d3edecdbd69e6cf',1,'cv::cudev::operator-(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c02a04ef1608ad485d445c8e43753b8',1,'cv::cudev::operator-(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbd34fbbcf43515301431c8978721c7a',1,'cv::cudev::operator-(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29b58bdfa78ef5c4d4beac53f7c79c35',1,'cv::cudev::operator-(const float3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae523601438b231456102587a02d29ce0',1,'cv::cudev::operator-(const float4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21579d3d75241e52a788ecda484e20d7',1,'cv::cudev::operator-(const float1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae12acf38186bf6dc6895da587665d36c',1,'cv::cudev::operator-(const float2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9befc50cf1641402af105f9b4ce54707',1,'cv::cudev::operator-(const double1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad871c5ff9bf246716e00f7215515a672',1,'cv::cudev::operator-(const double4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ae31a4395b49fa3b233e0c4ee9f78a1',1,'cv::cudev::operator-(const double3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12f0079672bd7bd0b168ce527cb706b',1,'cv::cudev::operator-(const double2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7852adc318a540c056ea73b49ae8286',1,'cv::cudev::operator-(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae414e560eefa2f108503e79e0a92ce79',1,'cv::cudev::operator-(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c78976f9105914f1896abb0b2ab712',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdaf3a734933d300a18e8e1573041e6a',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga595015df8ac886ee6161c8574c07b0bb',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f02e96ae1741da62734d90363e15b',1,'cv::cudev::operator-(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c2ec4b300add3f39cd2c2005fc9b03b',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga671d1eab95a685d83fb46a3caedaa0e4',1,'cv::cudev::operator-(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29088c5390150a10bd5900f805cf9562',1,'cv::cudev::operator-(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17c6cb1c28feab2d8e488026a90f789d',1,'cv::cudev::operator-(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c2b847a8648af7bb1bf5696a5593e1',1,'cv::cudev::operator-(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f2cad4b2513975e900f994e6ed677d6',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657470335930553724a92428b1eb9014',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa406a939d82354cec9279667daa1ca94',1,'cv::cudev::operator-(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b895e1f04d72d46b19f80936c9c0704',1,'cv::cudev::operator-(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49370160c90b69f0c6e98c898b527368',1,'cv::cudev::operator-(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f5ba88d0b852d2f86afc29e06f1e8a',1,'cv::cudev::operator-(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97c585e4f802affa218b50922504b4d7',1,'cv::cudev::operator-(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b8b588d37850f2a9d96602a6a5f7d67',1,'cv::cudev::operator-(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga222ce3784f3fc6433767ce8cdaa827f7',1,'cv::cudev::operator-(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2828d795db4524ad86acf6438336fa',1,'cv::cudev::operator-(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2684b612027b487618841db6c1850313',1,'cv::cudev::operator-(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7d0852b020342bc37b7e507a587905a',1,'cv::cudev::operator-(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9529413b121c4e0c8ee22482a4fab970',1,'cv::cudev::operator-(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5bf61216767dfa9c63290c776fc9dc30',1,'cv::cudev::operator-(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafffe9e12abf7a2013c656198bbfe4019',1,'cv::cudev::operator-(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f600b61f1a94b779ce862a1b2ddc83e',1,'cv::cudev::operator-(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3492f3658fe0c7b45d288f0700124307',1,'cv::cudev::operator-(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0ec17613882c822c1684d5e67aa3ff0',1,'cv::cudev::operator-(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01f9a0cf5655a5f3c4c2e78bde998754',1,'cv::cudev::operator-(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c66bc85731db1174c2eae7646fe8ae',1,'cv::cudev::operator-(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd83b96a13731954f8723e2275e3765',1,'cv::cudev::operator-(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157fca7e19a61dbf087d7654594d4e23',1,'cv::cudev::operator-(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55f1af68b4a753b3a6a3e078d91f1696',1,'cv::cudev::operator-(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf4e04da6c7b24130e4cc8e776a5339a',1,'cv::cudev::operator-(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73809cf57d17ff44a52c02c3b29ecfba',1,'cv::cudev::operator-(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6d871842daa1c70ea4caef8a76670ab',1,'cv::cudev::operator-(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3923c285bfc32ef157d97af42b4dbaa',1,'cv::cudev::operator-(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3091968102f4293b8a37fa22c26fde15',1,'cv::cudev::operator-(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga105d05b599ef729df2112db1626078c9',1,'cv::cudev::operator-(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fc141b8ac2f6e3aeba0e32424591d9',1,'cv::cudev::operator-(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c28d9ff3a737dfe37508d1608d4488',1,'cv::cudev::operator-(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace86d625860816056a815a5ac249841f',1,'cv::cudev::operator-(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c83494077d790efb9cce651ef5c8fb3',1,'cv::cudev::operator-(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fcb4deeb33df8bb7fabc3afdc922947',1,'cv::cudev::operator-(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d0e94e2a3ddb20e082a36b760b374c',1,'cv::cudev::operator-(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf528d8dbd1cb9132a7d8acc3f11b0a89',1,'cv::cudev::operator-(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd1c46a4dceccd18eff03077f8e8da83',1,'cv::cudev::operator-(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26feff449ac4dab327561cc7b98ae303',1,'cv::cudev::operator-(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f0d316266abadce36d9f95350939051',1,'cv::cudev::operator-(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a790596a24ef36db89348e75d2858c',1,'cv::cudev::operator-(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cebc4fe6b6f94f836752ced678af6d6',1,'cv::cudev::operator-(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7912128120aa37fc63d046a614da79',1,'cv::cudev::operator-(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31fa210affd71e287fb5e9b483d8b4b7',1,'cv::cudev::operator-(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39a6f71ae25763350c835bab9dde6025',1,'cv::cudev::operator-(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c17045262474d8006617bf00a10ada',1,'cv::cudev::operator-(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3af755936e984d2d83fe6b1f520d014',1,'cv::cudev::operator-(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff766239f9095c4845abc49acf0e2dd0',1,'cv::cudev::operator-(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga750fd24726debf7081fb1118125a6775',1,'cv::cudev::operator-(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae62193899bb9cc343fa962b4b521e36c',1,'cv::cudev::operator-(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166ed0bcb9dd638829729f92695b12d0',1,'cv::cudev::operator-(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80d8077257094293bb466dab861ac473',1,'cv::cudev::operator-(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772e599865fe047c41f93d58af5c36be',1,'cv::cudev::operator-(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d7fa5317dd05a15f21aa3be368d6c79',1,'cv::cudev::operator-(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafecaf20edf9038a419b4963a649f1362',1,'cv::cudev::operator-(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a7b9dbe190b22a08f72e3f9334e3171',1,'cv::cudev::operator-(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60818b7e8929ee3491aad14dc0bbf7e7',1,'cv::cudev::operator-(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55574f511139402e4cd6820b2e3edeba',1,'cv::cudev::operator-(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9d8281a359296fae7b6ec188101ed8e',1,'cv::cudev::operator-(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7dad42ade73d46813a094b64808c6b8',1,'cv::cudev::operator-(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d789399fa52f9690e6e01fe8d653bc9',1,'cv::cudev::operator-(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24bad9cc2b3b3ac10c819d8fd2ae54e',1,'cv::cudev::operator-(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga064176b3aa847d4e254c1ec1db3f8324',1,'cv::cudev::operator-(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb5d9702bcfe0a2527b510cc84938a4',1,'cv::cudev::operator-(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga459d5db54e31c46b4c5982f98e42fa77',1,'cv::cudev::operator-(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb64bc3f5c6ee79fc1869e51e0e20ea',1,'cv::cudev::operator-(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab72d0df44e48d58d0a83680bcc64c0cd',1,'cv::cudev::operator-(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f14ce38edfb19ba6890f42c9e4bc1c7',1,'cv::cudev::operator-(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ca19596afc498b95a6a7b19375e2776',1,'cv::cudev::operator-(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga830cd97a436668d9feeb2ff08daead24',1,'cv::cudev::operator-(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0447438f3f039aaf24fe21d502153a6c',1,'cv::cudev::operator-(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac95b6a94f1155b246a18f3b845e3cfa7',1,'cv::cudev::operator-(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabecf086f97f0c60573f81155ce6df359',1,'cv::cudev::operator-(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa1778a2f54eb6eafc3a395173fac5b',1,'cv::cudev::operator-(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c69722cf7d46b2ca923926d0a9e7c29',1,'cv::cudev::operator-(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301f25e5157f16b4a044760a1ba51957',1,'cv::cudev::operator-(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga234301df3e003ce08fa1154a6919c3e6',1,'cv::cudev::operator-(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga529a4056534c5e47aa59d256ad69795b',1,'cv::cudev::operator-(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe950dd17a8fa089fe286dc7513ed18b',1,'cv::cudev::operator-(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51346e7356a9c330b5874b3e3e8fdf7a',1,'cv::cudev::operator-(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga087dd0f490602b7f5212a8221cc4c631',1,'cv::cudev::operator-(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa922d047700892efb47a39e2b66e2df7',1,'cv::cudev::operator-(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga030665610f8a68470affbb8fc223480a',1,'cv::cudev::operator-(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9334f4344c1d1203f4e78bad75c7f7ac',1,'cv::cudev::operator-(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c175694697819d86c134405fef567d',1,'cv::cudev::operator-(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c871fd39d365299a7087e48c132e66',1,'cv::cudev::operator-(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35c6854bb46e9164eec0218f869a9b9',1,'cv::cudev::operator-(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97621dfd01d12393ecd93025efb3565f',1,'cv::cudev::operator-(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb1c3da793075b09989fc44ae3f1b9ed',1,'cv::cudev::operator-(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f6f8843f95be97da2d9dd97203a57a7',1,'cv::cudev::operator-(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4b21b2c12c7e804eff3159893bf0da',1,'cv::cudev::operator-(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f8acd15bb673d2ddb88d3fc032f7f46',1,'cv::cudev::operator-(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b1a551cfaf5a99c6fe30782af1dee38',1,'cv::cudev::operator-(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8718012438f8242708e0e7c59e30c0f3',1,'cv::cudev::operator-(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b256b2cc48a9181623a38977e3bac00',1,'cv::cudev::operator-(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58ed6ef928b50877a894f409e8464ac2',1,'cv::cudev::operator-(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77dd6b885a2b9b9b4c44d74be2dbfd74',1,'cv::cudev::operator-(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga599164264373b33e0a535211c0fdccb5',1,'cv::cudev::operator-(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99636b5731e60af2c22851c30f4e1cc2',1,'cv::cudev::operator-(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f068655bf1a117d63ee8d12c9123bc',1,'cv::cudev::operator-(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68155cb7567a70e34854e308bad38bf0',1,'cv::cudev::operator-(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6789124b74d1f4bd32bcbbf0501d6bd',1,'cv::cudev::operator-(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c14a811c0156b0a39c727300af59a3d',1,'cv::cudev::operator-(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628b15bea2200f623235e780644b4738',1,'cv::cudev::operator-(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaed8862546424053275a74eb182123b1',1,'cv::cudev::operator-(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf917f33a395906b4ee4b0d09d3abb4fa',1,'cv::cudev::operator-(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c898d588a40dd071eec1f8c2c74b39f',1,'cv::cudev::operator-(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd0d6d85ac669a3f90307e30aa3cbe00',1,'cv::cudev::operator-(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e5740217efa8fe0abf0abcc760328d',1,'cv::cudev::operator-(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9dd88cc2cbce6d9e4778d60fc7921f7',1,'cv::cudev::operator-(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b9334faac50e773d70fc8dfd0b5ecbe',1,'cv::cudev::operator-(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e525a4e0063c46db0f94eeb30818210',1,'cv::cudev::operator-(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81998f25744b975fc9ad36d109ac830b',1,'cv::cudev::operator-(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd199a5f6d3af032060b2c2d22651ba0',1,'cv::cudev::operator-(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587458f4a3b6baaae54d1bf38c608fdd',1,'cv::cudev::operator-(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c43181792568fdac96ab1f34606f45',1,'cv::cudev::operator-(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad30d5dabcda24d862172a45f57790b0d',1,'cv::cudev::operator-(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71cc98fe99d705fe3f356355a5972c54',1,'cv::cudev::operator-(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae1659d27c0d33e75d72445deaf55930',1,'cv::cudev::operator-(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98feed4df5a73a8ddd6d51b8321af344',1,'cv::cudev::operator-(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b4b59a36beb43c49f01fb86f1bc890',1,'cv::cudev::operator-(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0775017854d4e2b772d672168bd9a5c',1,'cv::cudev::operator-(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b1fa561df0ed7972108d66f89c5c496',1,'cv::cudev::operator-(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf9102f7c51e3a2d88b9073206820a55',1,'cv::cudev::operator-(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2316196b4a8bd1c46e519dd2fc4c3851',1,'cv::cudev::operator-(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3075a67dd4ae9b7543c5e4c897f5ff45',1,'cv::cudev::operator-(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9ba6b5d0f5f1a8ed6d93e4f0ab5e173',1,'cv::cudev::operator-(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedcf75a12dd00e1c503c9106e44a3e98',1,'cv::cudev::operator-(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01b9153cf9b4f0369155cb594e2d1349',1,'cv::cudev::operator-(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ff1bf6c7c124e0c8bd913479790866a',1,'cv::cudev::operator-(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabed2cc5868115ee18468aa3cebb3be19',1,'cv::cudev::operator-(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e312d4b86154b204240572d9e86effd',1,'cv::cudev::operator-(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0418e4172197c9fa9dcd41c9fb3b20f9',1,'cv::cudev::operator-(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b532e3190010cf8358b124e3dde328',1,'cv::cudev::operator-(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195ae36c11666e48a9947af768d97b44',1,'cv::cudev::operator-(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b120b8e056fc331b8069bf1a9ed6fff',1,'cv::cudev::operator-(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8362b5b231be23340c5fb8b99cbb375e',1,'cv::cudev::operator-(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga082c28863107b352ac51038a23d06300',1,'cv::cudev::operator-(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga915ab09a582414ca39929cdb812f758a',1,'cv::cudev::operator-(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ea8ddbac826668fdc04ab8f99e66d9',1,'cv::cudev::operator-(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc941af3597d7061a0661159a5469162',1,'cv::cudev::operator-(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94ea2c59d0991a2fc0298c7f5a24e50',1,'cv::cudev::operator-(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2270da17955731575fe008dc96c80bda',1,'cv::cudev::operator-(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ffb86ec221c92f569ae47db8d52119b',1,'cv::cudev::operator-(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab28b46e72d03a0922e710b43695f2',1,'cv::cudev::operator-(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga145db2039b6488ede1742843b830bbb2',1,'cv::cudev::operator-(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf3a6db03ab93d4b436c9f15c1e465a8',1,'cv::cudev::operator-(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6255c2cad7df67e3ad4f26a084d74747',1,'cv::cudev::operator-(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c8779b714a767af06374cf179cd7658',1,'cv::cudev::operator-(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3588ea327af30d0380dbf86c67fbbe26',1,'cv::cudev::operator-(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f7485ba0075a5d14504be9792dd6cda',1,'cv::cudev::operator-(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87cd3d2a3cfacd0af275e8f65e593c07',1,'cv::cudev::operator-(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga431f094ce3f6ed4a524c1456032d1e5c',1,'cv::cudev::operator-(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cb9157344792d1668368b76d2b53ef0',1,'cv::cudev::operator-(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e51e2db4cf854a1b534e27fef30aea5',1,'cv::cudev::operator-(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00481995ead0bbef7bcaabe8670ab440',1,'cv::cudev::operator-(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f6440ffc7c49757d421ff30eec6483a',1,'cv::cudev::operator-(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c8857ba62a6011efbd8731351b3668',1,'cv::cudev::operator-(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf70bf655a23b655608d8076f4feee13',1,'cv::cudev::operator-(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe035a4f4b0e3ea2ea1b7026a6c67dcd',1,'cv::cudev::operator-(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14497e7403c99dfbc1ff4bedc3d68f6',1,'cv::cudev::operator-(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d805c90bfeba48408241237e149aae6',1,'cv::cudev::operator-(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8a8ad77bfd017bc91c32cf644962ab7',1,'cv::cudev::operator-(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabdaef661a90228ba7259c77122b9a03',1,'cv::cudev::operator-(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e260d1cb3780fad10c72cadc0c49c0f',1,'cv::cudev::operator-(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf94b2d97816dcd6619274fb4feeae0f5',1,'cv::cudev::operator-(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2144e86d0a8c877122ccb1cbcfe55524',1,'cv::cudev::operator-(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a39a0486a0d1f390b5f009cb61d18d9',1,'cv::cudev::operator-(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcef7c7a90b8afae18f0e59c1e1ade46',1,'cv::cudev::operator-(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8802eb31440714af8c5920c08a8fbaf8',1,'cv::cudev::operator-(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf470cfb079490ca0efc9e425d8a23737',1,'cv::cudev::operator-(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b0501a5e044aaf1b9138c442f2422c2',1,'cv::cudev::operator-(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd60b5d630bd0b3ae6a4d8f53c5205',1,'cv::cudev::operator-(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1c549d5b7cc2b71327ce10502f39db',1,'cv::cudev::operator-(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99eba581458fcdf17f4e91d73459ce96',1,'cv::cudev::operator-(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c920201791dc95f7e59f0a77524a4d9',1,'cv::cudev::operator-(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf83e424e36e12a70fed05d67393f4fa9',1,'cv::cudev::operator-(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga869ba8c0391f2954ec9b51b84e4cb037',1,'cv::cudev::operator-(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286015c3a12eb08da7fee407884e7f35',1,'cv::cudev::operator-(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadece9875b31689e0880c626826fa8a14',1,'cv::cudev::operator-(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa095d5d102f9325c5700eb1fd989f69b',1,'cv::cudev::operator-(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga835e06caee26a307b42ac4b6cae3eb36',1,'cv::cudev::operator-(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f1f7629c16642fa581b16c2898a05ff',1,'cv::cudev::operator-(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf868783fdecde414693bbcb9db17628e',1,'cv::cudev::operator-(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga213848161d7be3d9c73dba5e709b079b',1,'cv::cudev::operator-(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac118a8f2d822cd667b833e12a796be34',1,'cv::cudev::operator-(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae51bb9b05a4f76f5c3a01cf3db5962',1,'cv::cudev::operator-(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d855d60a702b3918c841a26570601a3',1,'cv::cudev::operator-(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e27485d93087eacf685d1498e74f556',1,'cv::cudev::operator-(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5d66d9588e722109b30fac960662e64',1,'cv::cudev::operator-(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34688ab71722659850f777051315dc27',1,'cv::cudev::operator-(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga557b681e893a841fe02f17a00d62eaa1',1,'cv::cudev::operator-(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf80315d6f88dfcbcf02c76f8ee8f953c',1,'cv::cudev::operator-(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa89552d0de95801c80b2bb3a5e6435d1',1,'cv::cudev::operator-(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf23698f18f04d1250221e6746b4c9810',1,'cv::cudev::operator-(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fd1d6f3e17ba35584f39da603e25c82',1,'cv::cudev::operator-(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f33fccdd0d3fa940bd3f443b24f8d5',1,'cv::cudev::operator-(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ceff4b71ebb6b58c8efdb4de80df7cb',1,'cv::cudev::operator-(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236c690b63999f1e9f07c84fb1dedc5f',1,'cv::cudev::operator-(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1094d7d71d2aefc1869c72347e53d09f',1,'cv::cudev::operator-(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ce9e9e1c97e5f00df933988651acc3',1,'cv::cudev::operator-(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga183b0f68b7e993cf1d10ce74cf656f63',1,'cv::cudev::operator-(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c95d1121a4fd678e416dd219bc2eff2',1,'cv::cudev::operator-(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2c1e422a17e927b9bc13516d09691ef',1,'cv::cudev::operator-(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga377b580b41f8a05440b4a4298e79847c',1,'cv::cudev::operator-(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbdfcaf718602ea178cefb40abc3199b',1,'cv::cudev::operator-(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50daff19a60364c8d50211b6150f7bde',1,'cv::cudev::operator-(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46d693e48f72432105a7694db15cb16b',1,'cv::cudev::operator-(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c2a9c4da615af916d394e1357098827',1,'cv::cudev::operator-(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa834729f3bf1a45f6bccba9dc8df5872',1,'cv::cudev::operator-(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c42e1c911cd6ced910f9c7c39e6217',1,'cv::cudev::operator-(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28c6d90fc518cd3304a57dfc88446779',1,'cv::cudev::operator-(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07106a51535e185bcf711ed49575530d',1,'cv::cudev::operator-(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4c9e88d426e7f6991f6e34b107f56cc',1,'cv::cudev::operator-(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga00fec559cf58adaedb43c5092df36b84',1,'operator-(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gabb6d151a3faa03d866700dd46f0ad04a',1,'operator-() const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf6a12deaeedcf12e67dc695caff1068',1,'operator-(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga657904e675f20f6b84d7821cf1b02576',1,'operator-(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5c17b1b5b5fe0b3b4e8e5bd32cbf72b',1,'operator-(const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8218dac34f71c38487a697ea52557259',1,'operator-(const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga369f1d0d8d3803abcc6e10bf145d4edd',1,'operator-(const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cccd86250a11d8e232198edf4251f14',1,'operator-(const Expr< Body > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafcebc509ca2a96c5b80ab1b96926b5c',1,'operator-(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32e53e6cd3aa0aec01a90c11008c5a',1,'operator-(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa812557e00bb932af910630701a2e6d5',1,'operator-(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga212b4e512e56d38893b3d94109f19e5a',1,'operator-(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga923d4bc9a45182d9ff86558f8c3b3e1a',1,'operator-(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf43079f133408f0dd329fa6f1d316f34',1,'operator-(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5400e7e698ff6fb2a8e8eb929b71e818',1,'operator-(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07f833d814ae15aa1f7f06fc72285d71',1,'operator-(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630122d5ecd56ab75dc7a740237d4277',1,'operator-(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga589105db257ea2341d3edecdbd69e6cf',1,'operator-(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c02a04ef1608ad485d445c8e43753b8',1,'operator-(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbd34fbbcf43515301431c8978721c7a',1,'operator-(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29b58bdfa78ef5c4d4beac53f7c79c35',1,'operator-(const float3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae523601438b231456102587a02d29ce0',1,'operator-(const float4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21579d3d75241e52a788ecda484e20d7',1,'operator-(const float1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae12acf38186bf6dc6895da587665d36c',1,'operator-(const float2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9befc50cf1641402af105f9b4ce54707',1,'operator-(const double1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad871c5ff9bf246716e00f7215515a672',1,'operator-(const double4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ae31a4395b49fa3b233e0c4ee9f78a1',1,'operator-(const double3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12f0079672bd7bd0b168ce527cb706b',1,'operator-(const double2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa7852adc318a540c056ea73b49ae8286',1,'operator-(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae414e560eefa2f108503e79e0a92ce79',1,'operator-(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c78976f9105914f1896abb0b2ab712',1,'operator-(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdaf3a734933d300a18e8e1573041e6a',1,'operator-(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga595015df8ac886ee6161c8574c07b0bb',1,'operator-(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f02e96ae1741da62734d90363e15b',1,'operator-(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c2ec4b300add3f39cd2c2005fc9b03b',1,'operator-(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga671d1eab95a685d83fb46a3caedaa0e4',1,'operator-(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29088c5390150a10bd5900f805cf9562',1,'operator-(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17c6cb1c28feab2d8e488026a90f789d',1,'operator-(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48c2b847a8648af7bb1bf5696a5593e1',1,'operator-(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f2cad4b2513975e900f994e6ed677d6',1,'operator-(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga657470335930553724a92428b1eb9014',1,'operator-(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa406a939d82354cec9279667daa1ca94',1,'operator-(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b895e1f04d72d46b19f80936c9c0704',1,'operator-(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49370160c90b69f0c6e98c898b527368',1,'operator-(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f5ba88d0b852d2f86afc29e06f1e8a',1,'operator-(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97c585e4f802affa218b50922504b4d7',1,'operator-(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b8b588d37850f2a9d96602a6a5f7d67',1,'operator-(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga222ce3784f3fc6433767ce8cdaa827f7',1,'operator-(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c2828d795db4524ad86acf6438336fa',1,'operator-(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2684b612027b487618841db6c1850313',1,'operator-(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7d0852b020342bc37b7e507a587905a',1,'operator-(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9529413b121c4e0c8ee22482a4fab970',1,'operator-(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5bf61216767dfa9c63290c776fc9dc30',1,'operator-(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafffe9e12abf7a2013c656198bbfe4019',1,'operator-(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f600b61f1a94b779ce862a1b2ddc83e',1,'operator-(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3492f3658fe0c7b45d288f0700124307',1,'operator-(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0ec17613882c822c1684d5e67aa3ff0',1,'operator-(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01f9a0cf5655a5f3c4c2e78bde998754',1,'operator-(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c66bc85731db1174c2eae7646fe8ae',1,'operator-(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadd83b96a13731954f8723e2275e3765',1,'operator-(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga157fca7e19a61dbf087d7654594d4e23',1,'operator-(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55f1af68b4a753b3a6a3e078d91f1696',1,'operator-(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf4e04da6c7b24130e4cc8e776a5339a',1,'operator-(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73809cf57d17ff44a52c02c3b29ecfba',1,'operator-(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6d871842daa1c70ea4caef8a76670ab',1,'operator-(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3923c285bfc32ef157d97af42b4dbaa',1,'operator-(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3091968102f4293b8a37fa22c26fde15',1,'operator-(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga105d05b599ef729df2112db1626078c9',1,'operator-(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae5fc141b8ac2f6e3aeba0e32424591d9',1,'operator-(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c28d9ff3a737dfe37508d1608d4488',1,'operator-(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace86d625860816056a815a5ac249841f',1,'operator-(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c83494077d790efb9cce651ef5c8fb3',1,'operator-(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fcb4deeb33df8bb7fabc3afdc922947',1,'operator-(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94d0e94e2a3ddb20e082a36b760b374c',1,'operator-(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf528d8dbd1cb9132a7d8acc3f11b0a89',1,'operator-(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd1c46a4dceccd18eff03077f8e8da83',1,'operator-(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26feff449ac4dab327561cc7b98ae303',1,'operator-(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f0d316266abadce36d9f95350939051',1,'operator-(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0a790596a24ef36db89348e75d2858c',1,'operator-(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cebc4fe6b6f94f836752ced678af6d6',1,'operator-(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a7912128120aa37fc63d046a614da79',1,'operator-(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31fa210affd71e287fb5e9b483d8b4b7',1,'operator-(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39a6f71ae25763350c835bab9dde6025',1,'operator-(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7c17045262474d8006617bf00a10ada',1,'operator-(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab3af755936e984d2d83fe6b1f520d014',1,'operator-(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff766239f9095c4845abc49acf0e2dd0',1,'operator-(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga750fd24726debf7081fb1118125a6775',1,'operator-(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae62193899bb9cc343fa962b4b521e36c',1,'operator-(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga166ed0bcb9dd638829729f92695b12d0',1,'operator-(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80d8077257094293bb466dab861ac473',1,'operator-(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga772e599865fe047c41f93d58af5c36be',1,'operator-(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d7fa5317dd05a15f21aa3be368d6c79',1,'operator-(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafecaf20edf9038a419b4963a649f1362',1,'operator-(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a7b9dbe190b22a08f72e3f9334e3171',1,'operator-(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60818b7e8929ee3491aad14dc0bbf7e7',1,'operator-(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55574f511139402e4cd6820b2e3edeba',1,'operator-(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9d8281a359296fae7b6ec188101ed8e',1,'operator-(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7dad42ade73d46813a094b64808c6b8',1,'operator-(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d789399fa52f9690e6e01fe8d653bc9',1,'operator-(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24bad9cc2b3b3ac10c819d8fd2ae54e',1,'operator-(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga064176b3aa847d4e254c1ec1db3f8324',1,'operator-(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb5d9702bcfe0a2527b510cc84938a4',1,'operator-(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga459d5db54e31c46b4c5982f98e42fa77',1,'operator-(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb64bc3f5c6ee79fc1869e51e0e20ea',1,'operator-(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab72d0df44e48d58d0a83680bcc64c0cd',1,'operator-(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f14ce38edfb19ba6890f42c9e4bc1c7',1,'operator-(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ca19596afc498b95a6a7b19375e2776',1,'operator-(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga830cd97a436668d9feeb2ff08daead24',1,'operator-(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0447438f3f039aaf24fe21d502153a6c',1,'operator-(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac95b6a94f1155b246a18f3b845e3cfa7',1,'operator-(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabecf086f97f0c60573f81155ce6df359',1,'operator-(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacaa1778a2f54eb6eafc3a395173fac5b',1,'operator-(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c69722cf7d46b2ca923926d0a9e7c29',1,'operator-(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga301f25e5157f16b4a044760a1ba51957',1,'operator-(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga234301df3e003ce08fa1154a6919c3e6',1,'operator-(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga529a4056534c5e47aa59d256ad69795b',1,'operator-(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafe950dd17a8fa089fe286dc7513ed18b',1,'operator-(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51346e7356a9c330b5874b3e3e8fdf7a',1,'operator-(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga087dd0f490602b7f5212a8221cc4c631',1,'operator-(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa922d047700892efb47a39e2b66e2df7',1,'operator-(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga030665610f8a68470affbb8fc223480a',1,'operator-(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9334f4344c1d1203f4e78bad75c7f7ac',1,'operator-(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c175694697819d86c134405fef567d',1,'operator-(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91c871fd39d365299a7087e48c132e66',1,'operator-(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35c6854bb46e9164eec0218f869a9b9',1,'operator-(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97621dfd01d12393ecd93025efb3565f',1,'operator-(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb1c3da793075b09989fc44ae3f1b9ed',1,'operator-(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f6f8843f95be97da2d9dd97203a57a7',1,'operator-(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc4b21b2c12c7e804eff3159893bf0da',1,'operator-(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f8acd15bb673d2ddb88d3fc032f7f46',1,'operator-(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b1a551cfaf5a99c6fe30782af1dee38',1,'operator-(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8718012438f8242708e0e7c59e30c0f3',1,'operator-(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b256b2cc48a9181623a38977e3bac00',1,'operator-(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58ed6ef928b50877a894f409e8464ac2',1,'operator-(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77dd6b885a2b9b9b4c44d74be2dbfd74',1,'operator-(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga599164264373b33e0a535211c0fdccb5',1,'operator-(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99636b5731e60af2c22851c30f4e1cc2',1,'operator-(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53f068655bf1a117d63ee8d12c9123bc',1,'operator-(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68155cb7567a70e34854e308bad38bf0',1,'operator-(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6789124b74d1f4bd32bcbbf0501d6bd',1,'operator-(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c14a811c0156b0a39c727300af59a3d',1,'operator-(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga628b15bea2200f623235e780644b4738',1,'operator-(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaed8862546424053275a74eb182123b1',1,'operator-(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf917f33a395906b4ee4b0d09d3abb4fa',1,'operator-(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c898d588a40dd071eec1f8c2c74b39f',1,'operator-(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd0d6d85ac669a3f90307e30aa3cbe00',1,'operator-(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27e5740217efa8fe0abf0abcc760328d',1,'operator-(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9dd88cc2cbce6d9e4778d60fc7921f7',1,'operator-(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b9334faac50e773d70fc8dfd0b5ecbe',1,'operator-(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e525a4e0063c46db0f94eeb30818210',1,'operator-(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81998f25744b975fc9ad36d109ac830b',1,'operator-(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd199a5f6d3af032060b2c2d22651ba0',1,'operator-(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587458f4a3b6baaae54d1bf38c608fdd',1,'operator-(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21c43181792568fdac96ab1f34606f45',1,'operator-(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad30d5dabcda24d862172a45f57790b0d',1,'operator-(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71cc98fe99d705fe3f356355a5972c54',1,'operator-(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae1659d27c0d33e75d72445deaf55930',1,'operator-(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga98feed4df5a73a8ddd6d51b8321af344',1,'operator-(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b4b59a36beb43c49f01fb86f1bc890',1,'operator-(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0775017854d4e2b772d672168bd9a5c',1,'operator-(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b1fa561df0ed7972108d66f89c5c496',1,'operator-(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf9102f7c51e3a2d88b9073206820a55',1,'operator-(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2316196b4a8bd1c46e519dd2fc4c3851',1,'operator-(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3075a67dd4ae9b7543c5e4c897f5ff45',1,'operator-(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9ba6b5d0f5f1a8ed6d93e4f0ab5e173',1,'operator-(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaedcf75a12dd00e1c503c9106e44a3e98',1,'operator-(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01b9153cf9b4f0369155cb594e2d1349',1,'operator-(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ff1bf6c7c124e0c8bd913479790866a',1,'operator-(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabed2cc5868115ee18468aa3cebb3be19',1,'operator-(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e312d4b86154b204240572d9e86effd',1,'operator-(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0418e4172197c9fa9dcd41c9fb3b20f9',1,'operator-(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44b532e3190010cf8358b124e3dde328',1,'operator-(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195ae36c11666e48a9947af768d97b44',1,'operator-(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b120b8e056fc331b8069bf1a9ed6fff',1,'operator-(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8362b5b231be23340c5fb8b99cbb375e',1,'operator-(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga082c28863107b352ac51038a23d06300',1,'operator-(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga915ab09a582414ca39929cdb812f758a',1,'operator-(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55ea8ddbac826668fdc04ab8f99e66d9',1,'operator-(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc941af3597d7061a0661159a5469162',1,'operator-(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94ea2c59d0991a2fc0298c7f5a24e50',1,'operator-(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2270da17955731575fe008dc96c80bda',1,'operator-(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ffb86ec221c92f569ae47db8d52119b',1,'operator-(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab28b46e72d03a0922e710b43695f2',1,'operator-(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga145db2039b6488ede1742843b830bbb2',1,'operator-(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf3a6db03ab93d4b436c9f15c1e465a8',1,'operator-(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6255c2cad7df67e3ad4f26a084d74747',1,'operator-(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c8779b714a767af06374cf179cd7658',1,'operator-(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3588ea327af30d0380dbf86c67fbbe26',1,'operator-(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f7485ba0075a5d14504be9792dd6cda',1,'operator-(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87cd3d2a3cfacd0af275e8f65e593c07',1,'operator-(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga431f094ce3f6ed4a524c1456032d1e5c',1,'operator-(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cb9157344792d1668368b76d2b53ef0',1,'operator-(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e51e2db4cf854a1b534e27fef30aea5',1,'operator-(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00481995ead0bbef7bcaabe8670ab440',1,'operator-(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f6440ffc7c49757d421ff30eec6483a',1,'operator-(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0c8857ba62a6011efbd8731351b3668',1,'operator-(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf70bf655a23b655608d8076f4feee13',1,'operator-(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabe035a4f4b0e3ea2ea1b7026a6c67dcd',1,'operator-(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14497e7403c99dfbc1ff4bedc3d68f6',1,'operator-(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d805c90bfeba48408241237e149aae6',1,'operator-(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8a8ad77bfd017bc91c32cf644962ab7',1,'operator-(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabdaef661a90228ba7259c77122b9a03',1,'operator-(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e260d1cb3780fad10c72cadc0c49c0f',1,'operator-(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf94b2d97816dcd6619274fb4feeae0f5',1,'operator-(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2144e86d0a8c877122ccb1cbcfe55524',1,'operator-(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a39a0486a0d1f390b5f009cb61d18d9',1,'operator-(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcef7c7a90b8afae18f0e59c1e1ade46',1,'operator-(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8802eb31440714af8c5920c08a8fbaf8',1,'operator-(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf470cfb079490ca0efc9e425d8a23737',1,'operator-(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b0501a5e044aaf1b9138c442f2422c2',1,'operator-(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bfd60b5d630bd0b3ae6a4d8f53c5205',1,'operator-(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1c549d5b7cc2b71327ce10502f39db',1,'operator-(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99eba581458fcdf17f4e91d73459ce96',1,'operator-(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c920201791dc95f7e59f0a77524a4d9',1,'operator-(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf83e424e36e12a70fed05d67393f4fa9',1,'operator-(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga869ba8c0391f2954ec9b51b84e4cb037',1,'operator-(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga286015c3a12eb08da7fee407884e7f35',1,'operator-(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadece9875b31689e0880c626826fa8a14',1,'operator-(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa095d5d102f9325c5700eb1fd989f69b',1,'operator-(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga835e06caee26a307b42ac4b6cae3eb36',1,'operator-(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f1f7629c16642fa581b16c2898a05ff',1,'operator-(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf868783fdecde414693bbcb9db17628e',1,'operator-(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga213848161d7be3d9c73dba5e709b079b',1,'operator-(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac118a8f2d822cd667b833e12a796be34',1,'operator-(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae51bb9b05a4f76f5c3a01cf3db5962',1,'operator-(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d855d60a702b3918c841a26570601a3',1,'operator-(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e27485d93087eacf685d1498e74f556',1,'operator-(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5d66d9588e722109b30fac960662e64',1,'operator-(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34688ab71722659850f777051315dc27',1,'operator-(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga557b681e893a841fe02f17a00d62eaa1',1,'operator-(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf80315d6f88dfcbcf02c76f8ee8f953c',1,'operator-(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa89552d0de95801c80b2bb3a5e6435d1',1,'operator-(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf23698f18f04d1250221e6746b4c9810',1,'operator-(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fd1d6f3e17ba35584f39da603e25c82',1,'operator-(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26f33fccdd0d3fa940bd3f443b24f8d5',1,'operator-(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ceff4b71ebb6b58c8efdb4de80df7cb',1,'operator-(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236c690b63999f1e9f07c84fb1dedc5f',1,'operator-(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1094d7d71d2aefc1869c72347e53d09f',1,'operator-(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ce9e9e1c97e5f00df933988651acc3',1,'operator-(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga183b0f68b7e993cf1d10ce74cf656f63',1,'operator-(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5c95d1121a4fd678e416dd219bc2eff2',1,'operator-(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab2c1e422a17e927b9bc13516d09691ef',1,'operator-(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga377b580b41f8a05440b4a4298e79847c',1,'operator-(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbdfcaf718602ea178cefb40abc3199b',1,'operator-(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50daff19a60364c8d50211b6150f7bde',1,'operator-(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46d693e48f72432105a7694db15cb16b',1,'operator-(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c2a9c4da615af916d394e1357098827',1,'operator-(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa834729f3bf1a45f6bccba9dc8df5872',1,'operator-(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8c42e1c911cd6ced910f9c7c39e6217',1,'operator-(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28c6d90fc518cd3304a57dfc88446779',1,'operator-(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07106a51535e185bcf711ed49575530d',1,'operator-(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf4c9e88d426e7f6991f6e34b107f56cc',1,'operator-(double s, const double2 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaab018c47cc4e8f0dfa471622a784677b',1,'std::operator-(const complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5c472f8066a2430d37e23f0c29c45718',1,'std::operator-(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9fb72f354a48fc4332fed44a47c562fd',1,'std::operator-(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga526ecc839bcebb2dbb970cee1d3de8d3',1,'std::operator-(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga9098fadcbe59e0ba2fa8590bd8388f5e',1,'std::tr2::operator-()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaab018c47cc4e8f0dfa471622a784677b',1,'operator-(const complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5c472f8066a2430d37e23f0c29c45718',1,'operator-(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9fb72f354a48fc4332fed44a47c562fd',1,'operator-(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga526ecc839bcebb2dbb970cee1d3de8d3',1,'operator-(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga9098fadcbe59e0ba2fa8590bd8388f5e',1,'operator-(const dynamic_bitset< _WordT, _Alloc > &__x, const dynamic_bitset< _WordT, _Alloc > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga028b49a6d0cf1f6afa48149603d953b2',1,'operator-() const(Global Namespace)']]], + ['operator_2d_2d_112',['operator--',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a792a43266d40b85aca7fd5ccce99a689',1,'cv::MatConstIterator::operator--()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a9ebb7e43682a724ce28d8715fc29a783',1,'cv::MatConstIterator::operator--(int)'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#acd66a482fbc19586f2dfd47ebba6b448',1,'cv::MatConstIterator_::operator--()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ab07d8d0b89c903f779a021c2c97c8420',1,'cv::MatConstIterator_::operator--(int)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a7882f8680fe5a579a8cff9e77b876e34',1,'cv::MatIterator_::operator--()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#aacbd0bc9e0eccb76169a7bc3188527ad',1,'cv::MatIterator_::operator--(int)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a240e65582faf3f08a0cc9268063efdf0',1,'cv::SparseMatConstIterator::operator--()'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#ae1e53a3cb951f9c3647c18e160fa124f',1,'cv::SparseMatConstIterator::operator--(int)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a013970df0401622fc82f1e3b4aafeb73',1,'std::reverse_iterator::operator--()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#ac7ab8ae9e2d74a1456d6d835e3de74e5',1,'std::reverse_iterator::operator--(int)']]], + ['operator_2d_3d_113',['operator-=',['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#a881e7011fee862380940bef019551dc6',1,'cv::MatConstIterator::operator-=()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#af05c490f19f8e10d3d81c7697e007e98',1,'cv::MatConstIterator_::operator-=()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ad0d1fe9aba83851f42462de9365268a2',1,'cv::MatIterator_::operator-=()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'cv::Matx::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'cv::Matx::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< _Tp, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< _Tp, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 1, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 1, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 2 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 2 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 3, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< double, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 2, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, 3, 3 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float, cn, 1 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float_type, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#a3d208fa179aeab2d36e96613ba784c7e',1,'Matx< float_type, 4, 4 >::operator-=(Matx< _Tp1, m, n > &a, const Matx< _Tp2, m, n > &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga27579376dfdbd8e4ffcdb7b3f0b7efe8',1,'cv::softdouble::operator-=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga855ef9ba871cb9fb4c2f7034966af711',1,'cv::softfloat::operator-=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'cv::Vec::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'cv::Vec::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< _Tp, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< _Tp, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, 4 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< double, nFeatures >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 2 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a772c997c5c21e6984cb0ef7fef95eba3',1,'Vec< float, 3 >::operator-=(Vec< _Tp1, cn > &a, const Vec< _Tp2, cn > &b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01919.html#a6e9d5332bf641e4bebfc4d94b407bfd0',1,'std::complex::operator-=(const _Tp &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaacea589517bdac6f85963e345f09ee17',1,'std::complex::operator-=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06235.html#af98737e3474e12ecb9d40f19bea2ea9e',1,'std::fpos::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac25a53dfa03677767990c5a3af186cf8',1,'std::gslice_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8eb0f010a6a61d5066af1b3e757b87b9',1,'std::indirect_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7e8b4e636a4ccb6a93f289308d2d6c7e',1,'std::mask_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a194e833ea2d84161f1bf3f996d1d1d5f',1,'std::reverse_iterator::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaaa8967e72a60fc2b6f8f422dc970ea1f',1,'std::slice_array::operator-=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a821d3b176095151a3557a0aa6f7871e4',1,'std::tr2::dynamic_bitset::operator-=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a821d3b176095151a3557a0aa6f7871e4',1,'std::tr2::dynamic_bitset::operator-=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4667f35667105d1ec1aa3e763c503cd4',1,'std::valarray::operator-=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e7ec75f9c2dd61177a35d939ce85f11',1,'std::valarray::operator-=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4667f35667105d1ec1aa3e763c503cd4',1,'valarray< size_t >::operator-=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e7ec75f9c2dd61177a35d939ce85f11',1,'valarray< size_t >::operator-=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#aac76a5e5e735b97f955189825cef7e2c',1,'Eigen::ArrayBase::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#aac76a5e5e735b97f955189825cef7e2c',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1042124b0ddee66e78ac7b0a9ac4cc9c',1,'Eigen::MatrixBase::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1042124b0ddee66e78ac7b0a9ac4cc9c',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a1042124b0ddee66e78ac7b0a9ac4cc9c',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a79ff0326cd78da5bb2bdc4a88f5428c9',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'Eigen::VectorwiseOp::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Derived, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Derived, Vertical >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator-=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a6bb3a7315617f86f0c28ac05816cf6e3',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator-=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gad5ad464e467385af9b4183e1689fa720',1,'cv::operator-=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga855ef9ba871cb9fb4c2f7034966af711',1,'operator-=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga27579376dfdbd8e4ffcdb7b3f0b7efe8',1,'operator-=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gad5ad464e467385af9b4183e1689fa720',1,'operator-=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaacea589517bdac6f85963e345f09ee17',1,'operator-=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac25a53dfa03677767990c5a3af186cf8',1,'operator-=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4667f35667105d1ec1aa3e763c503cd4',1,'operator-=(const _Tp &)(Global Namespace)']]], + ['operator_2d_3e_114',['operator->',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#af9c384816f316388b844f764d50c5ef7',1,'cv::util::optional::operator->()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a656e8f03c9c93365ad168cc141682658',1,'cv::util::optional::operator->() const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#afff5687d9255ad33daa6780dda27b6c5',1,'__gnu_debug::_Safe_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a4789f11d5d5c248e478a79f590186f1a',1,'__gnu_debug::_Safe_local_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a60137368e9df33aaca43271c842f0dea',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a60137368e9df33aaca43271c842f0dea',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a2096ba7f4be3c22e0f883172ba323f5c',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a2096ba7f4be3c22e0f883172ba323f5c',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#afff5687d9255ad33daa6780dda27b6c5',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#afff5687d9255ad33daa6780dda27b6c5',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a4f35a84ace173bc8b49e7b15af544bdc',1,'const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12095.html#ab0ed1f338073d1926501cc11769724d9',1,'iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a4f35a84ace173bc8b49e7b15af544bdc',1,'point_const_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#a281f49eca5033b2d2bd3c5f369bdb9e0',1,'point_iterator_::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#a26129c2150ef03c1d8d33a3bbe65ef23',1,'std::auto_ptr::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#acff5a9bfb1ef4383f413ea2cc8f6ef7d',1,'std::regex_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#aec95fbb6d9ff5cca02e86c2f8bdd3de9',1,'std::regex_token_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#ab256f3da0cdc3212fd9f676e70fcfa74',1,'std::reverse_iterator::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'std::unique_ptr::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Codecvt >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Res_type >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Result< _Res > >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< _Result_base >::operator->()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ad0486e6ff29eac8f1384948a4184e442',1,'unique_ptr< bool[]>::operator->()']]], + ['operator_2f_115',['operator/',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4fd7c94c36187ae1dd810e5e1cb98506',1,'cv::MatExpr::operator/(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9f4860191ebc911882258adb3ed81220',1,'cv::MatExpr::operator/(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7d490d89368ae09a8034d3ef145f1b75',1,'cv::MatExpr::operator/(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6f76b7cbb9b728896ffb90522796a1c7',1,'cv::MatExpr::operator/(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27472a7b10eb061860f2d44e91ce2016',1,'cv::MatExpr::operator/(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aa27acc5fc0baa71648720825da8d7c8d',1,'cv::MatExpr::operator/(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af1c42ad483f7b6947e17db0c508c4292',1,'cv::MatExpr::operator/(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a296be1bafb9c82f8fd4ec55ea5f3ef81',1,'cv::MatExpr::operator/(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af0227aa2a8b2fb11495e9efc2ce8a9b6',1,'cv::MatExpr::operator/(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a86f61f74c4c8c305218ab7f6e1ad7f87',1,'cv::MatExpr::operator/(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a4fd7c94c36187ae1dd810e5e1cb98506',1,'cv::MatExpr::operator/(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9f4860191ebc911882258adb3ed81220',1,'cv::MatExpr::operator/(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a7d490d89368ae09a8034d3ef145f1b75',1,'cv::MatExpr::operator/(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a6f76b7cbb9b728896ffb90522796a1c7',1,'cv::MatExpr::operator/(const MatExpr &e, const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27472a7b10eb061860f2d44e91ce2016',1,'cv::MatExpr::operator/(const Mat &m, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aa27acc5fc0baa71648720825da8d7c8d',1,'cv::MatExpr::operator/(const MatExpr &e, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af1c42ad483f7b6947e17db0c508c4292',1,'cv::MatExpr::operator/(double s, const MatExpr &e)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a296be1bafb9c82f8fd4ec55ea5f3ef81',1,'cv::MatExpr::operator/(const MatExpr &e1, const MatExpr &e2)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#af0227aa2a8b2fb11495e9efc2ce8a9b6',1,'cv::MatExpr::operator/(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a86f61f74c4c8c305218ab7f6e1ad7f87',1,'cv::MatExpr::operator/(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga995d0eb099efa09893b36adecda4243a',1,'cv::softdouble::operator/()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaad5d6d10fa57557f159b67b9618bf557',1,'cv::softfloat::operator/()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'cv::Vec::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< _Tp, 4 >::operator/(const Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 2 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 3 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, 4 >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< double, nFeatures >::operator/(const Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 2 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a3172bb79e4dae501a7bc0639be4662a5',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a04c1f2379046e771039cf2419fc7a5fb',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afac595c10a852134519ea91f0685d6e6',1,'Vec< float, 3 >::operator/(const Vec< float, cn > &a, double alpha)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'Eigen::VectorwiseOp::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Derived, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Derived, Vertical >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator/()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#aa154a8407885a9ad51504180f6d7a163',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator/()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga73e22cc4b1f8a3132abc30677ed531c4',1,'cv::operator/()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63c10edfae5414877b679eeb58c9f4a7',1,'cv::cudev::operator/(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2abad8ee149156b1c5538b6fc541638',1,'cv::cudev::operator/(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1a1c4ccd594dd41d946649a7ab1ca3',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfba9463c82a223ac76103d9bcf16aa0',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1782e839b0d1c68438dbecfcac2820ac',1,'cv::cudev::operator/(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabaec01b86941bbff223af9d2c29e68bc',1,'cv::cudev::operator/(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0f36028b3f87632fbadae1cf5f2d03',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8314510e1d4316367ac391f110059454',1,'cv::cudev::operator/(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9036097b144dbf93817c5ef126d116d0',1,'cv::cudev::operator/(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8db65d14cd813f8d457b921c39bb27a8',1,'cv::cudev::operator/(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c6b1c78bd2dbea3ea062235736e7329',1,'cv::cudev::operator/(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d4687efb816dcbc5a403deef46acdb',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3bfcae1affcdf5e57f963f93722a04c3',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa73d74035bcb8e99515b0e082068845',1,'cv::cudev::operator/(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26c9c7aac034c3c77d2c7fcafb2b7324',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b20a16f030f203ca1246b182ee58fd5',1,'cv::cudev::operator/(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89c3f0a954a006a68c412300414e17de',1,'cv::cudev::operator/(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520991356f52a0254059d9542c16006',1,'cv::cudev::operator/(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ef2415aa67752f6a252d4f7d068a526',1,'cv::cudev::operator/(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68da45fdf82b957dbb2cf14a027c0322',1,'cv::cudev::operator/(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67a4465bc93192a57e10555bccc96bda',1,'cv::cudev::operator/(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga906b0deabff7997bb4d80ae166a137c3',1,'cv::cudev::operator/(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a7b51f10d165feaae86cd0bc18e91e1',1,'cv::cudev::operator/(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a6cbf801c763c54dbd07832815194bd',1,'cv::cudev::operator/(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52e5285f48a908e86ff891aed2d743f2',1,'cv::cudev::operator/(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a2a30fd3e15d27a99f3b7d1917f9e38',1,'cv::cudev::operator/(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga624a50622e8a386f768ef3190ef08ba8',1,'cv::cudev::operator/(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac63ba9fe41878226447c261efbb516c1',1,'cv::cudev::operator/(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga436022693ffe3e23663fa33b1512e777',1,'cv::cudev::operator/(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5877c60845ecd0eb7145b119e6513b55',1,'cv::cudev::operator/(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ef3fffb48e92a7a50f3851c5fb7338b',1,'cv::cudev::operator/(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad520b1c01bd7118c82548f6cb020238f',1,'cv::cudev::operator/(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae93cb2fb69f84957b45190513bc4ac38',1,'cv::cudev::operator/(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadff98c44d9758083f04c7eee4e7d5a3e',1,'cv::cudev::operator/(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga549d0f141917aec8ef972c77971c1084',1,'cv::cudev::operator/(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508053e4393ce90846ce4974907d317a',1,'cv::cudev::operator/(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga583198460ba33f63a71a030fb51ea4ec',1,'cv::cudev::operator/(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a8182f4c0412f05ec96d4f734619f65',1,'cv::cudev::operator/(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae209c1b38d254292bf2ff0ca617d96bd',1,'cv::cudev::operator/(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7ce642e9cb3aad8237b74e57545ec0',1,'cv::cudev::operator/(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc358c56da85f1e9fb45ec4379aef819',1,'cv::cudev::operator/(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37633241bee5b78408d690bea4d6bc97',1,'cv::cudev::operator/(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182216df7f15de3724ac89de6dbbdc08',1,'cv::cudev::operator/(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24d234d3496e5365fcc0181c864bee8f',1,'cv::cudev::operator/(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84226e77b868bda78abaa855e431f83b',1,'cv::cudev::operator/(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5065b677cee6eaf61c4990fab2fef59b',1,'cv::cudev::operator/(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45b4e9375b6e30685cc40474d84ccf02',1,'cv::cudev::operator/(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2025f63f3d90e41dec633bedd58357e',1,'cv::cudev::operator/(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86d40a00cbb232d5d72ba19ec81ed438',1,'cv::cudev::operator/(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc622e639c83e90f061aea4d908af53',1,'cv::cudev::operator/(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8126bd6f60da8d7fcb39cb6abd253bdc',1,'cv::cudev::operator/(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae06070c3075afe5424512508edb81586',1,'cv::cudev::operator/(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga460f926abfd82d2b3f91e886ee6d6aa4',1,'cv::cudev::operator/(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19e6a6945b5af142801ced01b619f993',1,'cv::cudev::operator/(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaade20eaaba20908f19ea46982534d36f',1,'cv::cudev::operator/(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d97c6ab31477097c28510e7b449979f',1,'cv::cudev::operator/(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07c8153666fa828bf51ba1df3d037641',1,'cv::cudev::operator/(const uchar1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace9317803db502fe7a302c33e81fde41',1,'cv::cudev::operator/(int s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04b6dbca2658111aa32e4b32f88e3d29',1,'cv::cudev::operator/(const uchar2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb7d476559b303db2472d6effecb2f89',1,'cv::cudev::operator/(const uchar3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab32e30453cfc72ff1b0aa78c8a1b2d',1,'cv::cudev::operator/(int s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfda695bfc877ea25dbf96d5b554676',1,'cv::cudev::operator/(const uchar4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3addc09f491a734516e0b7dd2b44179',1,'cv::cudev::operator/(int s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a4539fab45842a06a5edecc85beb00',1,'cv::cudev::operator/(int s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad727324599c518090bdfccf7b8e08c22',1,'cv::cudev::operator/(const uchar1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5db301a86ed3528e1ae4d332a6f30fd2',1,'cv::cudev::operator/(float s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53358badb500dfd70e070cf1ebfd0a18',1,'cv::cudev::operator/(const uchar2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56dffbd26015a50c0bc5aa6ebb742c31',1,'cv::cudev::operator/(const uchar3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac92b8e55ec04f04b2c031123d997c266',1,'cv::cudev::operator/(float s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987dcefef0b62d8bc37af554235fe0ef',1,'cv::cudev::operator/(const uchar4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab67eafd771d2282a502fdbd6c54ead06',1,'cv::cudev::operator/(float s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ab843a5f0b70aad934d6c3e5c5b8257',1,'cv::cudev::operator/(float s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga947ed5817156d062129c8903c0603e95',1,'cv::cudev::operator/(const uchar1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5eed4cb9d49becaa49611f544539d206',1,'cv::cudev::operator/(double s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05241f798415de42c5da5c69c55aef11',1,'cv::cudev::operator/(const uchar2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf24592373ca8cb6278d42bd53e8184a',1,'cv::cudev::operator/(const uchar3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99f77817f5ca8058516194a9dd63c283',1,'cv::cudev::operator/(double s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed1bde145568955c9f1131d91a4e0614',1,'cv::cudev::operator/(const uchar4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cc5fea7eec39d991a9bca1c5d65f450',1,'cv::cudev::operator/(double s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2564bcebc93bb19ad1ef13ad520ed4d',1,'cv::cudev::operator/(double s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6829aff16fde91d0e7465d0fb6e62913',1,'cv::cudev::operator/(const char1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50208cff6a446a4b35ac2f8688eebce0',1,'cv::cudev::operator/(int s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa97fbcd1bc2ad1f58b02b567645c9d61',1,'cv::cudev::operator/(const char2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga816379a4f078d68b1c4c351dad009189',1,'cv::cudev::operator/(const char3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabef9e42d02bba8884bfad5fbe70bbada',1,'cv::cudev::operator/(int s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17a0b78772e84b3e73b6890b49d340e1',1,'cv::cudev::operator/(const char4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga794491c37dd2df850f3893138414353a',1,'cv::cudev::operator/(int s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b08fc0b7dbd5277deb26cdc85008b2d',1,'cv::cudev::operator/(int s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b04679db179bda54f1e9d0d2673ffc4',1,'cv::cudev::operator/(const char1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8034cd977168fcbeb64d0f143c27dd6c',1,'cv::cudev::operator/(const char2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad760f8b985f9f78e6f7cfae125c57952',1,'cv::cudev::operator/(const char3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab37aec5734a505aa76159bb43f68a636',1,'cv::cudev::operator/(float s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c116242125c2ea7d6aaef804c309757',1,'cv::cudev::operator/(const char4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ba61529ddd1ed3f0329c56b834999a1',1,'cv::cudev::operator/(float s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga113d7371aab51f681e1e5e82d268c3ee',1,'cv::cudev::operator/(float s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65207a98a6ba24f91f6d735a88c4ae11',1,'cv::cudev::operator/(float s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4cab124d95ea36b40f41915cb6c52e',1,'cv::cudev::operator/(double s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c0325622303ec37f5a35fdb5acb4aba',1,'cv::cudev::operator/(const char1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51668d8071ec45f300736c84386a95de',1,'cv::cudev::operator/(const char2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ba06691317169f995b1e4f84af326f',1,'cv::cudev::operator/(const char3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cd026898af4d75be94752d39ea86285',1,'cv::cudev::operator/(const char4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f6d00516b5705d5b0bfe98574781f29',1,'cv::cudev::operator/(double s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf2e26c94589161b5aa1ff904b3d91c1',1,'cv::cudev::operator/(double s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1fd8b99c66de2ff572d583fd379f9a3',1,'cv::cudev::operator/(double s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga941fdc20547d924ada48cfb0e59957c2',1,'cv::cudev::operator/(int s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147f7c5b249d5eec2f5edbe9d663f023',1,'cv::cudev::operator/(const ushort1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a2f63e1448c1423a462cb3802dbc1fc',1,'cv::cudev::operator/(const ushort2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f9f5d4955d4910a88edc28d264773a',1,'cv::cudev::operator/(const ushort3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788722f37dc7eedf7369be91a27b2baf',1,'cv::cudev::operator/(const ushort4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0784968a2beace1b43d5bfcad6895bf8',1,'cv::cudev::operator/(int s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4107f0212b5bd97903dbc0fd113a55bd',1,'cv::cudev::operator/(int s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f7aee12ad93a7ddeb22a39e77fbb649',1,'cv::cudev::operator/(int s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86164b5b800cbf1a1bc1da69dc6b1cea',1,'cv::cudev::operator/(float s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffb8f750584cbf3428cca25579fa9e0e',1,'cv::cudev::operator/(const ushort1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddffd612d0a062ab2c7c63f809d32103',1,'cv::cudev::operator/(const ushort2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8efa47e085c080af09f59676bce38003',1,'cv::cudev::operator/(const ushort3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3701eb47de8686f78f358575ee69eab',1,'cv::cudev::operator/(const ushort4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4996cdd2cf5b7d7f88201b3280b9b882',1,'cv::cudev::operator/(float s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efd1425a4f37f08505df7138be39786',1,'cv::cudev::operator/(float s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb65bc0269df370c51277a668fcdcc73',1,'cv::cudev::operator/(float s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa92a62d328a8ab3e85e80b52693d156c',1,'cv::cudev::operator/(const ushort1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72f5c3ec2dbedb3f1150559435cb430b',1,'cv::cudev::operator/(const ushort2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391153a0840528f075a6fc407e841c10',1,'cv::cudev::operator/(const ushort3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadeb192837562e5c4b8d82f8ab38bf084',1,'cv::cudev::operator/(double s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2f238b633143c3e6b22b2b8579c53e',1,'cv::cudev::operator/(const ushort4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f1ef76972820abe1d3a3ae91e95de4',1,'cv::cudev::operator/(double s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15fa7ad89e9bafc4993276448a0d3bd5',1,'cv::cudev::operator/(double s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab15f13356b2c04e4c2c4cebdcf6e4b',1,'cv::cudev::operator/(double s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafae9c481f30b10a2c900bf4a4da08af8',1,'cv::cudev::operator/(const short1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7ca775d4ec4865729ecdc345dab1e30',1,'cv::cudev::operator/(int s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade1df8d73b8ac8fb3fd2fb853a0c187a',1,'cv::cudev::operator/(const short2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe8737c01957c40118140eec1bf68d9',1,'cv::cudev::operator/(const short3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6c52b2d2d236023ea59691301f17cc',1,'cv::cudev::operator/(int s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8435aa501c96247ea59d3ea8b947117e',1,'cv::cudev::operator/(const short4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga828cee39fcbf51a1644d44510c12b7b4',1,'cv::cudev::operator/(int s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c5f0b61d269ea3a00f58a1b80b09aa5',1,'cv::cudev::operator/(int s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94a4aa6688bbf6fb5dbe16962cf49041',1,'cv::cudev::operator/(float s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ac2bcd0e1c58eabcbba3caa878be93f',1,'cv::cudev::operator/(const short1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fccb24eadfc89075e1380c4a840226d',1,'cv::cudev::operator/(float s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f329583283b38d835e5111baa0e9ccb',1,'cv::cudev::operator/(const short2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac224098894c2dd93c45d36ce0aa2d8f0',1,'cv::cudev::operator/(const short3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf34d47c8fc399c1b5633a81e0a2a20aa',1,'cv::cudev::operator/(const short4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64c7907250e45a962209e2c4c8e3860d',1,'cv::cudev::operator/(float s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1db39b81ceb79ce30d5ff502387a0172',1,'cv::cudev::operator/(float s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e6457d8d8908556e5a6623bca43f0d5',1,'cv::cudev::operator/(const short1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22b5c96ff38d1d48b10aabad0e49be7b',1,'cv::cudev::operator/(double s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdf50d97f13cd4161262f9f7152c936c',1,'cv::cudev::operator/(const short2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga317fc707d6c32eb0344e606c409cd502',1,'cv::cudev::operator/(const short3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0dd8315bf86df24af59d7a26804f4af3',1,'cv::cudev::operator/(double s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca9088b2f5335ee8214a1dfbc42fd1d',1,'cv::cudev::operator/(const short4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1aaea7b03c2dff6baf65f0054823b44',1,'cv::cudev::operator/(double s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49c5598a8d2bcf1957abd74da1c06936',1,'cv::cudev::operator/(double s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d4fa53f21d88b5d9fa07222b90ee3c',1,'cv::cudev::operator/(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c71abb3cec3af512f67e4b7134f4870',1,'cv::cudev::operator/(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9763eb69ace36e922bdc23adf58fa071',1,'cv::cudev::operator/(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6426caf4d84767c4f4b4df77b4bd8f7',1,'cv::cudev::operator/(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b4c3fadce268d79da7c2e33e1aa8ac',1,'cv::cudev::operator/(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fda9fbfd0224f6806547e77bbc9bbec',1,'cv::cudev::operator/(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c9e4aecc482aeae0ebd4fc37b1efd7',1,'cv::cudev::operator/(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeffd81f4b90d5e1fb4f7d8658d595a73',1,'cv::cudev::operator/(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae885e6e18ed764df65cc712846fbcf82',1,'cv::cudev::operator/(const int1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e271106bb16c64506b78f50599ffad0',1,'cv::cudev::operator/(float s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2af76884f887a6bae64783d7cfa3fd5',1,'cv::cudev::operator/(const int2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga216608449d27058bfa3427d67089019b',1,'cv::cudev::operator/(const int3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85aa004a5cb3b6108b0041ad11574367',1,'cv::cudev::operator/(const int4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a42711792e9b1ed79c25959954adc',1,'cv::cudev::operator/(float s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04cb7fa059a6bfa8de34114ccb829475',1,'cv::cudev::operator/(float s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5c764c78ba7fc0170c586345d67cf82',1,'cv::cudev::operator/(float s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac28d28065b478079ccf4706cb328ad52',1,'cv::cudev::operator/(const int1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8722a51ca67c9eac25f2896535e5543d',1,'cv::cudev::operator/(double s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd7e6744dedace2790dda951604c16f4',1,'cv::cudev::operator/(const int2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac20d96aa5d9bc6828f580d98be9b274b',1,'cv::cudev::operator/(const int3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e16dd1de3cc6cdaa3e01b991cf1877',1,'cv::cudev::operator/(double s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d2ad56cb9b7935755ab98989621744',1,'cv::cudev::operator/(const int4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d36cf520a15e02c4639cf09d13638af',1,'cv::cudev::operator/(double s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae910a0177b6e5954def12c3e1ceb7889',1,'cv::cudev::operator/(double s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4b24fae841ff37f46b2f184e4214f49',1,'cv::cudev::operator/(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9fb15ffc426038614898e8cf6f5245',1,'cv::cudev::operator/(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad380b25d2ba11d6de6db82c39052900e',1,'cv::cudev::operator/(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b3207d6bf2685058ea4e895ac25c678',1,'cv::cudev::operator/(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15293a946d5146fd48c04f46b2b81845',1,'cv::cudev::operator/(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca80d86a8a80d0a596b3c5abdc0f5b7',1,'cv::cudev::operator/(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed6a240c984f95a345129f96274a9cfe',1,'cv::cudev::operator/(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9f5801f25493f31c7f636c3df933b99',1,'cv::cudev::operator/(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae74b42fba92a1278d5d20a37ff25668c',1,'cv::cudev::operator/(const uint1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21b3dbd89341fa3f444ea21ef6e0b2f5',1,'cv::cudev::operator/(float s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87509bef25c897cac8532e466e4d66a7',1,'cv::cudev::operator/(const uint2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6653c9349dcc4767667164b9c45ecc4f',1,'cv::cudev::operator/(const uint3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfbe8b6a853d911c6caa057249a2f3c2',1,'cv::cudev::operator/(float s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac53ae2c9994299b79543fd5d25284a85',1,'cv::cudev::operator/(const uint4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a5e479a1745b53490f2c08b0993c0e5',1,'cv::cudev::operator/(float s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f5210161d628f2d4e696f26fac33d7',1,'cv::cudev::operator/(float s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf75713de0f2b797667bb783913812cf5',1,'cv::cudev::operator/(const uint1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b57e7742e16dc732c96c86c7a25a7d',1,'cv::cudev::operator/(double s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53df6d0915ba0492a653459ccb61dd1e',1,'cv::cudev::operator/(const uint2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca76e1c82d8c8fa487273dd5488b5afc',1,'cv::cudev::operator/(const uint3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff3491be4e1aeb2d4b2ecfafac25bfc',1,'cv::cudev::operator/(double s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae20c5ffaf5dc093b018dbb2c623a4a9d',1,'cv::cudev::operator/(const uint4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga294bb78feefcf2213a99e3765bfcd590',1,'cv::cudev::operator/(double s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f4874876e654be2d30711f55ba67bb9',1,'cv::cudev::operator/(double s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931b2f3f4067c776bc79fa993f307479',1,'cv::cudev::operator/(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b00fe8b4c36cb662c4528caced6e021',1,'cv::cudev::operator/(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dd0224214d0591a4644c9fa753c613',1,'cv::cudev::operator/(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d8b0d5eb5f540043139d7077cd89acd',1,'cv::cudev::operator/(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa14eb5e414191a5110c9657940f4911f',1,'cv::cudev::operator/(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845184957965ee09b2c75d19b3c943b8',1,'cv::cudev::operator/(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98436d248883059f3789b0d0ee05623',1,'cv::cudev::operator/(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae36ded72b3f6a63e66bf8e6bedcd1246',1,'cv::cudev::operator/(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f5082bc85c86de08b2e0f479411caec',1,'cv::cudev::operator/(double s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d17e190d57f7cbaa40be123e2a51224',1,'cv::cudev::operator/(const float2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41a157235e0cf757bb61bdf97c135a56',1,'cv::cudev::operator/(const float1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5738156055f71a2394da2fd9986e73',1,'cv::cudev::operator/(const float3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cbd3ba36dcb1399c0cebe931b575705',1,'cv::cudev::operator/(double s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71437398c247ffa7ef5ced05aa8c32fd',1,'cv::cudev::operator/(const float4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca86550e3139b130209e6a73f8e288c',1,'cv::cudev::operator/(double s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a9725a2048b27de8e5b4b7a962b7a45',1,'cv::cudev::operator/(double s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga263e8628015d84cc51979ad5d9fab4dd',1,'cv::cudev::operator/(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3618b8f1c4483be2b49784692b55da93',1,'cv::cudev::operator/(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56abdc374d21db3f6d3a4750a60b46d4',1,'cv::cudev::operator/(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga964f4c517e631519f06210ca6e00a505',1,'cv::cudev::operator/(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7785eabab48b5412e4bec4c5ff9a221d',1,'cv::cudev::operator/(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga985d99669358177e1081cd19cea4fb7a',1,'cv::cudev::operator/(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ae6065edefcba07b4aab58590e4414',1,'cv::cudev::operator/(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8820b8c1e646e150d78c6c23192d99bc',1,'cv::cudev::operator/(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaad5d6d10fa57557f159b67b9618bf557',1,'operator/(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga995d0eb099efa09893b36adecda4243a',1,'operator/(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga73e22cc4b1f8a3132abc30677ed531c4',1,'operator/(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63c10edfae5414877b679eeb58c9f4a7',1,'operator/(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2abad8ee149156b1c5538b6fc541638',1,'operator/(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1a1c4ccd594dd41d946649a7ab1ca3',1,'operator/(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfba9463c82a223ac76103d9bcf16aa0',1,'operator/(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1782e839b0d1c68438dbecfcac2820ac',1,'operator/(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabaec01b86941bbff223af9d2c29e68bc',1,'operator/(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0f36028b3f87632fbadae1cf5f2d03',1,'operator/(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8314510e1d4316367ac391f110059454',1,'operator/(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9036097b144dbf93817c5ef126d116d0',1,'operator/(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8db65d14cd813f8d457b921c39bb27a8',1,'operator/(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c6b1c78bd2dbea3ea062235736e7329',1,'operator/(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4d4687efb816dcbc5a403deef46acdb',1,'operator/(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3bfcae1affcdf5e57f963f93722a04c3',1,'operator/(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa73d74035bcb8e99515b0e082068845',1,'operator/(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26c9c7aac034c3c77d2c7fcafb2b7324',1,'operator/(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b20a16f030f203ca1246b182ee58fd5',1,'operator/(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89c3f0a954a006a68c412300414e17de',1,'operator/(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9520991356f52a0254059d9542c16006',1,'operator/(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4ef2415aa67752f6a252d4f7d068a526',1,'operator/(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68da45fdf82b957dbb2cf14a027c0322',1,'operator/(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67a4465bc93192a57e10555bccc96bda',1,'operator/(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga906b0deabff7997bb4d80ae166a137c3',1,'operator/(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a7b51f10d165feaae86cd0bc18e91e1',1,'operator/(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a6cbf801c763c54dbd07832815194bd',1,'operator/(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52e5285f48a908e86ff891aed2d743f2',1,'operator/(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a2a30fd3e15d27a99f3b7d1917f9e38',1,'operator/(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga624a50622e8a386f768ef3190ef08ba8',1,'operator/(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac63ba9fe41878226447c261efbb516c1',1,'operator/(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga436022693ffe3e23663fa33b1512e777',1,'operator/(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5877c60845ecd0eb7145b119e6513b55',1,'operator/(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ef3fffb48e92a7a50f3851c5fb7338b',1,'operator/(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad520b1c01bd7118c82548f6cb020238f',1,'operator/(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae93cb2fb69f84957b45190513bc4ac38',1,'operator/(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadff98c44d9758083f04c7eee4e7d5a3e',1,'operator/(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga549d0f141917aec8ef972c77971c1084',1,'operator/(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga508053e4393ce90846ce4974907d317a',1,'operator/(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga583198460ba33f63a71a030fb51ea4ec',1,'operator/(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a8182f4c0412f05ec96d4f734619f65',1,'operator/(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae209c1b38d254292bf2ff0ca617d96bd',1,'operator/(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7ce642e9cb3aad8237b74e57545ec0',1,'operator/(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc358c56da85f1e9fb45ec4379aef819',1,'operator/(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37633241bee5b78408d690bea4d6bc97',1,'operator/(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182216df7f15de3724ac89de6dbbdc08',1,'operator/(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24d234d3496e5365fcc0181c864bee8f',1,'operator/(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga84226e77b868bda78abaa855e431f83b',1,'operator/(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5065b677cee6eaf61c4990fab2fef59b',1,'operator/(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45b4e9375b6e30685cc40474d84ccf02',1,'operator/(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2025f63f3d90e41dec633bedd58357e',1,'operator/(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86d40a00cbb232d5d72ba19ec81ed438',1,'operator/(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4bc622e639c83e90f061aea4d908af53',1,'operator/(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8126bd6f60da8d7fcb39cb6abd253bdc',1,'operator/(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae06070c3075afe5424512508edb81586',1,'operator/(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga460f926abfd82d2b3f91e886ee6d6aa4',1,'operator/(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19e6a6945b5af142801ced01b619f993',1,'operator/(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaade20eaaba20908f19ea46982534d36f',1,'operator/(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d97c6ab31477097c28510e7b449979f',1,'operator/(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07c8153666fa828bf51ba1df3d037641',1,'operator/(const uchar1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace9317803db502fe7a302c33e81fde41',1,'operator/(int s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04b6dbca2658111aa32e4b32f88e3d29',1,'operator/(const uchar2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb7d476559b303db2472d6effecb2f89',1,'operator/(const uchar3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab32e30453cfc72ff1b0aa78c8a1b2d',1,'operator/(int s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfda695bfc877ea25dbf96d5b554676',1,'operator/(const uchar4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3addc09f491a734516e0b7dd2b44179',1,'operator/(int s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3a4539fab45842a06a5edecc85beb00',1,'operator/(int s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad727324599c518090bdfccf7b8e08c22',1,'operator/(const uchar1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5db301a86ed3528e1ae4d332a6f30fd2',1,'operator/(float s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53358badb500dfd70e070cf1ebfd0a18',1,'operator/(const uchar2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56dffbd26015a50c0bc5aa6ebb742c31',1,'operator/(const uchar3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac92b8e55ec04f04b2c031123d997c266',1,'operator/(float s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987dcefef0b62d8bc37af554235fe0ef',1,'operator/(const uchar4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab67eafd771d2282a502fdbd6c54ead06',1,'operator/(float s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ab843a5f0b70aad934d6c3e5c5b8257',1,'operator/(float s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga947ed5817156d062129c8903c0603e95',1,'operator/(const uchar1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5eed4cb9d49becaa49611f544539d206',1,'operator/(double s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05241f798415de42c5da5c69c55aef11',1,'operator/(const uchar2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf24592373ca8cb6278d42bd53e8184a',1,'operator/(const uchar3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99f77817f5ca8058516194a9dd63c283',1,'operator/(double s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed1bde145568955c9f1131d91a4e0614',1,'operator/(const uchar4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cc5fea7eec39d991a9bca1c5d65f450',1,'operator/(double s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2564bcebc93bb19ad1ef13ad520ed4d',1,'operator/(double s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6829aff16fde91d0e7465d0fb6e62913',1,'operator/(const char1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga50208cff6a446a4b35ac2f8688eebce0',1,'operator/(int s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa97fbcd1bc2ad1f58b02b567645c9d61',1,'operator/(const char2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga816379a4f078d68b1c4c351dad009189',1,'operator/(const char3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabef9e42d02bba8884bfad5fbe70bbada',1,'operator/(int s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga17a0b78772e84b3e73b6890b49d340e1',1,'operator/(const char4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga794491c37dd2df850f3893138414353a',1,'operator/(int s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b08fc0b7dbd5277deb26cdc85008b2d',1,'operator/(int s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b04679db179bda54f1e9d0d2673ffc4',1,'operator/(const char1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8034cd977168fcbeb64d0f143c27dd6c',1,'operator/(const char2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad760f8b985f9f78e6f7cfae125c57952',1,'operator/(const char3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab37aec5734a505aa76159bb43f68a636',1,'operator/(float s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c116242125c2ea7d6aaef804c309757',1,'operator/(const char4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ba61529ddd1ed3f0329c56b834999a1',1,'operator/(float s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga113d7371aab51f681e1e5e82d268c3ee',1,'operator/(float s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga65207a98a6ba24f91f6d735a88c4ae11',1,'operator/(float s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d4cab124d95ea36b40f41915cb6c52e',1,'operator/(double s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c0325622303ec37f5a35fdb5acb4aba',1,'operator/(const char1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51668d8071ec45f300736c84386a95de',1,'operator/(const char2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8ba06691317169f995b1e4f84af326f',1,'operator/(const char3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9cd026898af4d75be94752d39ea86285',1,'operator/(const char4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f6d00516b5705d5b0bfe98574781f29',1,'operator/(double s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf2e26c94589161b5aa1ff904b3d91c1',1,'operator/(double s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1fd8b99c66de2ff572d583fd379f9a3',1,'operator/(double s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga941fdc20547d924ada48cfb0e59957c2',1,'operator/(int s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147f7c5b249d5eec2f5edbe9d663f023',1,'operator/(const ushort1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a2f63e1448c1423a462cb3802dbc1fc',1,'operator/(const ushort2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78f9f5d4955d4910a88edc28d264773a',1,'operator/(const ushort3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788722f37dc7eedf7369be91a27b2baf',1,'operator/(const ushort4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0784968a2beace1b43d5bfcad6895bf8',1,'operator/(int s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4107f0212b5bd97903dbc0fd113a55bd',1,'operator/(int s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f7aee12ad93a7ddeb22a39e77fbb649',1,'operator/(int s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86164b5b800cbf1a1bc1da69dc6b1cea',1,'operator/(float s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffb8f750584cbf3428cca25579fa9e0e',1,'operator/(const ushort1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddffd612d0a062ab2c7c63f809d32103',1,'operator/(const ushort2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8efa47e085c080af09f59676bce38003',1,'operator/(const ushort3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3701eb47de8686f78f358575ee69eab',1,'operator/(const ushort4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4996cdd2cf5b7d7f88201b3280b9b882',1,'operator/(float s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efd1425a4f37f08505df7138be39786',1,'operator/(float s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb65bc0269df370c51277a668fcdcc73',1,'operator/(float s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa92a62d328a8ab3e85e80b52693d156c',1,'operator/(const ushort1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72f5c3ec2dbedb3f1150559435cb430b',1,'operator/(const ushort2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391153a0840528f075a6fc407e841c10',1,'operator/(const ushort3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadeb192837562e5c4b8d82f8ab38bf084',1,'operator/(double s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2f238b633143c3e6b22b2b8579c53e',1,'operator/(const ushort4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11f1ef76972820abe1d3a3ae91e95de4',1,'operator/(double s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15fa7ad89e9bafc4993276448a0d3bd5',1,'operator/(double s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ab15f13356b2c04e4c2c4cebdcf6e4b',1,'operator/(double s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafae9c481f30b10a2c900bf4a4da08af8',1,'operator/(const short1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7ca775d4ec4865729ecdc345dab1e30',1,'operator/(int s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade1df8d73b8ac8fb3fd2fb853a0c187a',1,'operator/(const short2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe8737c01957c40118140eec1bf68d9',1,'operator/(const short3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6c52b2d2d236023ea59691301f17cc',1,'operator/(int s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8435aa501c96247ea59d3ea8b947117e',1,'operator/(const short4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga828cee39fcbf51a1644d44510c12b7b4',1,'operator/(int s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c5f0b61d269ea3a00f58a1b80b09aa5',1,'operator/(int s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94a4aa6688bbf6fb5dbe16962cf49041',1,'operator/(float s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ac2bcd0e1c58eabcbba3caa878be93f',1,'operator/(const short1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fccb24eadfc89075e1380c4a840226d',1,'operator/(float s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f329583283b38d835e5111baa0e9ccb',1,'operator/(const short2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac224098894c2dd93c45d36ce0aa2d8f0',1,'operator/(const short3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf34d47c8fc399c1b5633a81e0a2a20aa',1,'operator/(const short4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64c7907250e45a962209e2c4c8e3860d',1,'operator/(float s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1db39b81ceb79ce30d5ff502387a0172',1,'operator/(float s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e6457d8d8908556e5a6623bca43f0d5',1,'operator/(const short1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22b5c96ff38d1d48b10aabad0e49be7b',1,'operator/(double s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacdf50d97f13cd4161262f9f7152c936c',1,'operator/(const short2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga317fc707d6c32eb0344e606c409cd502',1,'operator/(const short3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0dd8315bf86df24af59d7a26804f4af3',1,'operator/(double s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca9088b2f5335ee8214a1dfbc42fd1d',1,'operator/(const short4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1aaea7b03c2dff6baf65f0054823b44',1,'operator/(double s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga49c5598a8d2bcf1957abd74da1c06936',1,'operator/(double s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16d4fa53f21d88b5d9fa07222b90ee3c',1,'operator/(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c71abb3cec3af512f67e4b7134f4870',1,'operator/(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9763eb69ace36e922bdc23adf58fa071',1,'operator/(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6426caf4d84767c4f4b4df77b4bd8f7',1,'operator/(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b4c3fadce268d79da7c2e33e1aa8ac',1,'operator/(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fda9fbfd0224f6806547e77bbc9bbec',1,'operator/(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1c9e4aecc482aeae0ebd4fc37b1efd7',1,'operator/(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeffd81f4b90d5e1fb4f7d8658d595a73',1,'operator/(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae885e6e18ed764df65cc712846fbcf82',1,'operator/(const int1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3e271106bb16c64506b78f50599ffad0',1,'operator/(float s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2af76884f887a6bae64783d7cfa3fd5',1,'operator/(const int2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga216608449d27058bfa3427d67089019b',1,'operator/(const int3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85aa004a5cb3b6108b0041ad11574367',1,'operator/(const int4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd1a42711792e9b1ed79c25959954adc',1,'operator/(float s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04cb7fa059a6bfa8de34114ccb829475',1,'operator/(float s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5c764c78ba7fc0170c586345d67cf82',1,'operator/(float s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac28d28065b478079ccf4706cb328ad52',1,'operator/(const int1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8722a51ca67c9eac25f2896535e5543d',1,'operator/(double s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd7e6744dedace2790dda951604c16f4',1,'operator/(const int2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac20d96aa5d9bc6828f580d98be9b274b',1,'operator/(const int3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75e16dd1de3cc6cdaa3e01b991cf1877',1,'operator/(double s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d2ad56cb9b7935755ab98989621744',1,'operator/(const int4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d36cf520a15e02c4639cf09d13638af',1,'operator/(double s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae910a0177b6e5954def12c3e1ceb7889',1,'operator/(double s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab4b24fae841ff37f46b2f184e4214f49',1,'operator/(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9fb15ffc426038614898e8cf6f5245',1,'operator/(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad380b25d2ba11d6de6db82c39052900e',1,'operator/(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b3207d6bf2685058ea4e895ac25c678',1,'operator/(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga15293a946d5146fd48c04f46b2b81845',1,'operator/(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca80d86a8a80d0a596b3c5abdc0f5b7',1,'operator/(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed6a240c984f95a345129f96274a9cfe',1,'operator/(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9f5801f25493f31c7f636c3df933b99',1,'operator/(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae74b42fba92a1278d5d20a37ff25668c',1,'operator/(const uint1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21b3dbd89341fa3f444ea21ef6e0b2f5',1,'operator/(float s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87509bef25c897cac8532e466e4d66a7',1,'operator/(const uint2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6653c9349dcc4767667164b9c45ecc4f',1,'operator/(const uint3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfbe8b6a853d911c6caa057249a2f3c2',1,'operator/(float s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac53ae2c9994299b79543fd5d25284a85',1,'operator/(const uint4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a5e479a1745b53490f2c08b0993c0e5',1,'operator/(float s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6f5210161d628f2d4e696f26fac33d7',1,'operator/(float s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf75713de0f2b797667bb783913812cf5',1,'operator/(const uint1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac8b57e7742e16dc732c96c86c7a25a7d',1,'operator/(double s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53df6d0915ba0492a653459ccb61dd1e',1,'operator/(const uint2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca76e1c82d8c8fa487273dd5488b5afc',1,'operator/(const uint3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ff3491be4e1aeb2d4b2ecfafac25bfc',1,'operator/(double s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae20c5ffaf5dc093b018dbb2c623a4a9d',1,'operator/(const uint4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga294bb78feefcf2213a99e3765bfcd590',1,'operator/(double s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4f4874876e654be2d30711f55ba67bb9',1,'operator/(double s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga931b2f3f4067c776bc79fa993f307479',1,'operator/(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8b00fe8b4c36cb662c4528caced6e021',1,'operator/(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4dd0224214d0591a4644c9fa753c613',1,'operator/(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d8b0d5eb5f540043139d7077cd89acd',1,'operator/(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa14eb5e414191a5110c9657940f4911f',1,'operator/(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga845184957965ee09b2c75d19b3c943b8',1,'operator/(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac98436d248883059f3789b0d0ee05623',1,'operator/(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae36ded72b3f6a63e66bf8e6bedcd1246',1,'operator/(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f5082bc85c86de08b2e0f479411caec',1,'operator/(double s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d17e190d57f7cbaa40be123e2a51224',1,'operator/(const float2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41a157235e0cf757bb61bdf97c135a56',1,'operator/(const float1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e5738156055f71a2394da2fd9986e73',1,'operator/(const float3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2cbd3ba36dcb1399c0cebe931b575705',1,'operator/(double s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71437398c247ffa7ef5ced05aa8c32fd',1,'operator/(const float4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca86550e3139b130209e6a73f8e288c',1,'operator/(double s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a9725a2048b27de8e5b4b7a962b7a45',1,'operator/(double s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga263e8628015d84cc51979ad5d9fab4dd',1,'operator/(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3618b8f1c4483be2b49784692b55da93',1,'operator/(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56abdc374d21db3f6d3a4750a60b46d4',1,'operator/(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga964f4c517e631519f06210ca6e00a505',1,'operator/(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7785eabab48b5412e4bec4c5ff9a221d',1,'operator/(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga985d99669358177e1081cd19cea4fb7a',1,'operator/(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ae6065edefcba07b4aab58590e4414',1,'operator/(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8820b8c1e646e150d78c6c23192d99bc',1,'operator/(const double2 &a, double s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga799ec0a9990b63bb54278d14b70b2d83',1,'std::operator/(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gace8f383fa21a65396e93711d963de127',1,'std::operator/(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9e32bc55ff4c92d724b1398241026af5',1,'std::operator/(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga799ec0a9990b63bb54278d14b70b2d83',1,'operator/(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gace8f383fa21a65396e93711d963de127',1,'operator/(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga9e32bc55ff4c92d724b1398241026af5',1,'operator/(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)']]], + ['operator_2f_3d_116',['operator/=',['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga0ee49b20d55c5902617e381807acb5bf',1,'cv::softdouble::operator/=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga93ae91dcfb3a27c7663a73aca75fd206',1,'cv::softfloat::operator/=()'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'cv::Vec::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< _Tp, 4 >::operator/=(Vec< _Tp, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 2 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 3 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, 4 >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< double, nFeatures >::operator/=(Vec< double, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 2 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#add504d9649102ab0a9cf7737ec256ff4',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, int alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#a9945a7ae41f49ddb19be8c43622c77fe',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, float alpha)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#afa8c8556cd2f6c96ef602351ad0815e0',1,'Vec< float, 3 >::operator/=(Vec< float, cn > &a, double alpha)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae2defbd37472f207493ea6b8a441899a',1,'std::complex::operator/=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga97944829154f734dd4b9df00a2e2820d',1,'std::complex::operator/=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4a86ee20d770ceb9779e865968faa6a7',1,'std::gslice_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2ea239d6f6f027caa976efe4821944d0',1,'std::indirect_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac1417dfc58271e6730675e151cd3dd06',1,'std::mask_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaea8c21a277b5dfee1f7f4b09c556259d',1,'std::slice_array::operator/=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15f95c715e3a16e30ff24477ccf4e502',1,'std::valarray::operator/=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4572c21b07ac304ac9d7062d2f5ae160',1,'std::valarray::operator/=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15f95c715e3a16e30ff24477ccf4e502',1,'valarray< size_t >::operator/=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4572c21b07ac304ac9d7062d2f5ae160',1,'valarray< size_t >::operator/=(const valarray< size_t > &)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a1717e11dfe9341e9cfba13140cedddce',1,'Eigen::ArrayBase::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a1717e11dfe9341e9cfba13140cedddce',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#af1b9165f5ab6b57a8305c0dc359adf7c',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'Eigen::VectorwiseOp::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Derived, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Derived, Vertical >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator/=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a9efa0b81915c31535a929a46a79cab2b',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator/=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a7395bd0af29ac23fd3f21543c935cdfa.html#a7395bd0af29ac23fd3f21543c935cdfa',1,'nlohmann::json_pointer::operator/=(const json_pointer &ptr)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_a7de51480324eb1c5a89ed552cd699875.html#a7de51480324eb1c5a89ed552cd699875',1,'nlohmann::json_pointer::operator/=(std::size_t array_idx)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1json__pointer_abdd21567b2b1d69329af0f520335e68b.html#abdd21567b2b1d69329af0f520335e68b',1,'nlohmann::json_pointer::operator/=(std::string token)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga310bc17ff9e6db416c9c633bb61ee868',1,'cv::operator/=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga93ae91dcfb3a27c7663a73aca75fd206',1,'operator/=(const softfloat &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga0ee49b20d55c5902617e381807acb5bf',1,'operator/=(const softdouble &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga310bc17ff9e6db416c9c633bb61ee868',1,'operator/=(v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gae2defbd37472f207493ea6b8a441899a',1,'operator/=(const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga97944829154f734dd4b9df00a2e2820d',1,'operator/=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga4a86ee20d770ceb9779e865968faa6a7',1,'operator/=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15f95c715e3a16e30ff24477ccf4e502',1,'operator/=(const _Tp &)(Global Namespace)']]], + ['operator_3c_117',['operator<',['https://docs.opencv.org/4.2.0/df/da3/structcv_1_1linemod_1_1QuantizedPyramid_1_1Candidate.html#aa07e4d047df342b0f27b19d1827714f5',1,'cv::linemod::QuantizedPyramid::Candidate::operator<()'],['https://docs.opencv.org/4.2.0/d4/de0/classcv_1_1DMatch.html#a61ebd9532acb52577d28c0dfefbcb660',1,'cv::DMatch::operator<()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ada726685b67ed5fa4432cc30fb854d34',1,'cv::FileNodeIterator::operator<(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#ada726685b67ed5fa4432cc30fb854d34',1,'cv::FileNodeIterator::operator<(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html#ae9655069c8161475dd6c1ff504a6c89f',1,'cv::detail::GraphEdge::operator<()'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a1a987ff8d8b29707c7562206e678a4e8',1,'cv::linemod::Match::operator<()'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga479ccee369fff799ced2c404cec35be7',1,'cv::stereo::Match::operator<()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8dbe9fe15d257dbb1a566dd5b752b718',1,'cv::MatExpr::operator<(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a200c6a55801095458ffba28d0bc2051f',1,'cv::MatExpr::operator<(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a027193236c695aef28e54acf23cad5ca',1,'cv::MatExpr::operator<(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac8bc126f547c720e5ec31ce26b31f6bd',1,'cv::MatExpr::operator<(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac30c6355f02755419479b1ffaadd5728',1,'cv::MatExpr::operator<(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8dbe9fe15d257dbb1a566dd5b752b718',1,'cv::MatExpr::operator<(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a200c6a55801095458ffba28d0bc2051f',1,'cv::MatExpr::operator<(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a027193236c695aef28e54acf23cad5ca',1,'cv::MatExpr::operator<(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac8bc126f547c720e5ec31ce26b31f6bd',1,'cv::MatExpr::operator<(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac30c6355f02755419479b1ffaadd5728',1,'cv::MatExpr::operator<(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4124a96f9c9f5f9ebdee548914bf7a04',1,'cv::softdouble::operator<()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga86f3dce677d4a2fb357774c872647522',1,'cv::softfloat::operator<()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga0e974552b8acc15ea6043ec9cb3a2f44',1,'cv::operator<()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga009cbdc2c91163c286b62fd0bda874c4',1,'cv::cudev::operator<(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga720988e66770098270dbf4cba3d0a570',1,'cv::cudev::operator<(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2de2ba6d33f0f4fcdce970163f47fdb',1,'cv::cudev::operator<(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1001ed9d71e36d2d05c7c0226e4b811e',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4360f50f4aa43506746b04131967e37f',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9233091fdc2614e17dc56697f473ffd',1,'cv::cudev::operator<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0fef7f08d2f37ea7d3e7e59dd68eb1',1,'cv::cudev::operator<(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16563b7c88d735d3b93688d49ecca618',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3351ed0be9b2d6c0f30e9fc13ff0c8f2',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3232fcf3bcad7b1bb9e25bc4dc8e8860',1,'cv::cudev::operator<(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8035e6b052b86212b9290f045b49880',1,'cv::cudev::operator<(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0c410fca36f863f7630eb9688527',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa6f80ff4bc920f6653de63d42ed7e4',1,'cv::cudev::operator<(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac87884be3df070c671185a3c337298f5',1,'cv::cudev::operator<(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14bd8d044c4a278d4ba11588f5de7e2',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d75de24d1d9fbceb70565ca0341945',1,'cv::cudev::operator<(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa80300a972f7a420a010418c5deba9ca',1,'cv::cudev::operator<(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2d5efdf0de121487a6c531f99a6aaef',1,'cv::cudev::operator<(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79ac15ae7290ba39734d1aa37b1f072d',1,'cv::cudev::operator<(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2876596449fc6df9b470e3fe7252b0b',1,'cv::cudev::operator<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4622e8f2d5fe5c36196f75bf8007b65',1,'cv::cudev::operator<(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9caf802fa8a65f71f42c8dffa60b318e',1,'cv::cudev::operator<(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dcde070edfa0b5575ce1b3ef503a779',1,'cv::cudev::operator<(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4162b25914b86079cf6b5c53a0bf92',1,'cv::cudev::operator<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1e0f762ec13a9e0696855d2e83c692',1,'cv::cudev::operator<(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbe24952f097c0d9c6c9a669c9cbc130',1,'cv::cudev::operator<(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d26c2d02ce10ebfb67caca78e3263c2',1,'cv::cudev::operator<(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9f48d27e0dee369fa39239649ff948a',1,'cv::cudev::operator<(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eaf9aa54d8f3da1be1ab7593bc2918d',1,'cv::cudev::operator<(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1984dfdc91c77e0b2c7e3b0a549964d0',1,'cv::cudev::operator<(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee672427c981240174bb011adf7eb2e8',1,'cv::cudev::operator<(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3197e6bd63fe3b34fa21cf628ab4b2',1,'cv::cudev::operator<(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa031b73d86c8be33e09376abc5865c0b',1,'cv::cudev::operator<(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8f7518c0f408bc6b3940a887bd66d98',1,'cv::cudev::operator<(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034332a898ca12ab5055dcf56d144bab',1,'cv::cudev::operator<(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29838c4abfedff62af6e26f3d62f1da3',1,'cv::cudev::operator<(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9955935230b18c47941eb13d110520',1,'cv::cudev::operator<(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf000ab97193855a862d9374ca0413322',1,'cv::cudev::operator<(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82e21f74ab115cb8d8b130ea0aa38de1',1,'cv::cudev::operator<(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29dfd373e87547b2189a785bdd2d2d30',1,'cv::cudev::operator<(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e3ceeaa992b5389d70a970e723ebcb6',1,'cv::cudev::operator<(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47537c956d1de80e0957697c5cfc5807',1,'cv::cudev::operator<(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1be1cc49d4cecd7a5429de37a81150',1,'cv::cudev::operator<(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27ccf7cfaefc9b9bb196d6134d514954',1,'cv::cudev::operator<(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a7cbda5c7b76068d44b423ba3180197',1,'cv::cudev::operator<(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8c2178181fbb679c4b0a9917b037d6',1,'cv::cudev::operator<(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5302aa2958867fbe5d6103d02587c42',1,'cv::cudev::operator<(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5c4b2c41ed0b03aa208217b10ecd153',1,'cv::cudev::operator<(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga273e57446ed81c0483ba887dd3f93acd',1,'cv::cudev::operator<(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga954fbd581d81f4a0f22937b67cf4bd1a',1,'cv::cudev::operator<(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f78c5aa99e7921f2acb3369662ea8',1,'cv::cudev::operator<(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99b41f158893fb62ff2ec68aa59e1fe8',1,'cv::cudev::operator<(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ba0f960fc417bb64c06b91985160306',1,'cv::cudev::operator<(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0fea95e1138b1be0462bfd06d39e21',1,'cv::cudev::operator<(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac69d2269b390083983094fc05522d3e4',1,'cv::cudev::operator<(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga502b1092946623165164f1eb3db5ec13',1,'cv::cudev::operator<(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacbd2df713f63e213f3c935942f8b789d',1,'cv::cudev::operator<(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cd8a0ab74fe1776ba27691cb9dc0bb1',1,'cv::cudev::operator<(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0dfcd65770b6f6f97c624b03b456219',1,'cv::cudev::operator<(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1c5fb881e5d825b65978c18468c2aa',1,'cv::cudev::operator<(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a482c5969940a7c6039aaaa365f1bc2',1,'cv::cudev::operator<(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc2b224af30927d91ccc96465940505',1,'cv::cudev::operator<(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e887a468977d874479b527d09649134',1,'cv::cudev::operator<(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9ee2e0ba4e219c9fd9f181a7a7e7829',1,'cv::cudev::operator<(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace7961c4f78672879296988127017dc7',1,'cv::cudev::operator<(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb96b9fa9eb4cfd5063728a52752c92',1,'cv::cudev::operator<(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20019500f5925231a8e453e066061b56',1,'cv::cudev::operator<(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef934652424e05dd36af802f8f463631',1,'cv::cudev::operator<(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fd192ad18d856a0df0189ac2df19e42',1,'cv::cudev::operator<(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395ea80af7d2745dab132bbdaa9d3894',1,'cv::cudev::operator<(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76bda195f33e2574a6c60450460c5e14',1,'cv::cudev::operator<(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07693623464c75318cf0dc62902993c9',1,'cv::cudev::operator<(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b93fe9997af973d95ce09182e6f83cd',1,'cv::cudev::operator<(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56a8ddd35f97a00f47f1c58174be300d',1,'cv::cudev::operator<(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd969c3c0fae8b79b41eb91e215a0f6c',1,'cv::cudev::operator<(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae23831834eef58d15594a6de775cb097',1,'cv::cudev::operator<(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae335ff1785c5c99e207d81955d320243',1,'cv::cudev::operator<(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587f8bd580b1cbf02d82319eee32cac9',1,'cv::cudev::operator<(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e02a23a9900338a83321e93d6cb849',1,'cv::cudev::operator<(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga123f05595c78e1eb9c5ae4af2df3fedf',1,'cv::cudev::operator<(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b933d7e73b54df55090a05d233e76ed',1,'cv::cudev::operator<(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab81a6520e9c56086d5938319b47f5ee4',1,'cv::cudev::operator<(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52733db0ac977cc46e56471cb549a6f4',1,'cv::cudev::operator<(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24c3d47e3e73e50e6a7c94175a0779a2',1,'cv::cudev::operator<(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga972d5282ac2202923f870ea8bb918140',1,'cv::cudev::operator<(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e4eca8de66ce6c3006c8c83dca5b83e',1,'cv::cudev::operator<(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd9e7ebda1d8aad9ca5b6dca517b019e',1,'cv::cudev::operator<(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf952eaa3fb132711c2f6ba89ebdd98b7',1,'cv::cudev::operator<(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga098db186cca858509dc51d532b5d7564',1,'cv::cudev::operator<(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a1be5b2b49f5e029ec733450ce10fbd',1,'cv::cudev::operator<(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga579e4cccc35c306c9bed75e01586aa9d',1,'cv::cudev::operator<(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfff9bd4dde1a4bb8e90b7c15e3a3bc1',1,'cv::cudev::operator<(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdd8113fc7213a912edfcb42071db45',1,'cv::cudev::operator<(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b13aeb71dbcf00af868786d733cb6b8',1,'cv::cudev::operator<(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga364d06fad2cedd8ea6ead77708f6872a',1,'cv::cudev::operator<(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf19430d38270527b027e367dd8f75374',1,'cv::cudev::operator<(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48f6f225dc0f298b4550e3bee2922237',1,'cv::cudev::operator<(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e9cb1782ba4f252f4bf7faa67e37a9f',1,'cv::cudev::operator<(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94129d6207f24868de8cb10ea14e103',1,'cv::cudev::operator<(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bcaa50d0526305b450eb7388e30e79',1,'cv::cudev::operator<(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41ad1e69567d7b71a7e5d251f5105b9',1,'cv::cudev::operator<(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47873f124d86cc20cc38b12aad2822a7',1,'cv::cudev::operator<(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a12a1d99cffc29b3a5d722a3bc24eb',1,'cv::cudev::operator<(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa774569fab758f87ea2f32da59541701',1,'cv::cudev::operator<(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e852a418f5730b03e7b2cee91cf78f5',1,'cv::cudev::operator<(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bc4c0b02d2261a0a8f073ea42012509',1,'cv::cudev::operator<(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac42d55945bb2f549eac6b422d70134e9',1,'cv::cudev::operator<(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b8bf0a9ddf12f5978fa840bbb1281c1',1,'cv::cudev::operator<(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe6f82b9b2d38747c4d07bdd384d344',1,'cv::cudev::operator<(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05d714d19bf702199d8bd7e008d8549c',1,'cv::cudev::operator<(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54d0a4a5dc2a8b97726c52d724cd7de4',1,'cv::cudev::operator<(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9d3a1bb44b76d738543a582e2178ebb',1,'cv::cudev::operator<(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3355798174802823946fd7d843d11e6e',1,'cv::cudev::operator<(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572769430e10effec5056d6df7efa16c',1,'cv::cudev::operator<(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ad33b110711b4827718cfef458d5ed7',1,'cv::cudev::operator<(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac72dfaedbb3a827ed78228af321574a1',1,'cv::cudev::operator<(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75730e1d5cede97eb4faf4f1bd833227',1,'cv::cudev::operator<(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e43019fba0109832ea5b5f74e1e92ff',1,'cv::cudev::operator<(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac46443ae5909e3a5066c06f208610caf',1,'cv::cudev::operator<(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae85889915d683c12e077cb4ec5083c2e',1,'cv::cudev::operator<(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga86f3dce677d4a2fb357774c872647522',1,'operator<(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga4124a96f9c9f5f9ebdee548914bf7a04',1,'operator<(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga0e974552b8acc15ea6043ec9cb3a2f44',1,'operator<(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga009cbdc2c91163c286b62fd0bda874c4',1,'operator<(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga720988e66770098270dbf4cba3d0a570',1,'operator<(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2de2ba6d33f0f4fcdce970163f47fdb',1,'operator<(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1001ed9d71e36d2d05c7c0226e4b811e',1,'operator<(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4360f50f4aa43506746b04131967e37f',1,'operator<(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9233091fdc2614e17dc56697f473ffd',1,'operator<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0fef7f08d2f37ea7d3e7e59dd68eb1',1,'operator<(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16563b7c88d735d3b93688d49ecca618',1,'operator<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3351ed0be9b2d6c0f30e9fc13ff0c8f2',1,'operator<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3232fcf3bcad7b1bb9e25bc4dc8e8860',1,'operator<(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa8035e6b052b86212b9290f045b49880',1,'operator<(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36da0c410fca36f863f7630eb9688527',1,'operator<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa6f80ff4bc920f6653de63d42ed7e4',1,'operator<(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac87884be3df070c671185a3c337298f5',1,'operator<(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf14bd8d044c4a278d4ba11588f5de7e2',1,'operator<(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga28d75de24d1d9fbceb70565ca0341945',1,'operator<(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa80300a972f7a420a010418c5deba9ca',1,'operator<(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad2d5efdf0de121487a6c531f99a6aaef',1,'operator<(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79ac15ae7290ba39734d1aa37b1f072d',1,'operator<(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2876596449fc6df9b470e3fe7252b0b',1,'operator<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4622e8f2d5fe5c36196f75bf8007b65',1,'operator<(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9caf802fa8a65f71f42c8dffa60b318e',1,'operator<(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dcde070edfa0b5575ce1b3ef503a779',1,'operator<(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d4162b25914b86079cf6b5c53a0bf92',1,'operator<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1e0f762ec13a9e0696855d2e83c692',1,'operator<(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadbe24952f097c0d9c6c9a669c9cbc130',1,'operator<(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d26c2d02ce10ebfb67caca78e3263c2',1,'operator<(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9f48d27e0dee369fa39239649ff948a',1,'operator<(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eaf9aa54d8f3da1be1ab7593bc2918d',1,'operator<(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1984dfdc91c77e0b2c7e3b0a549964d0',1,'operator<(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee672427c981240174bb011adf7eb2e8',1,'operator<(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d3197e6bd63fe3b34fa21cf628ab4b2',1,'operator<(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa031b73d86c8be33e09376abc5865c0b',1,'operator<(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad8f7518c0f408bc6b3940a887bd66d98',1,'operator<(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga034332a898ca12ab5055dcf56d144bab',1,'operator<(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29838c4abfedff62af6e26f3d62f1da3',1,'operator<(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f9955935230b18c47941eb13d110520',1,'operator<(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf000ab97193855a862d9374ca0413322',1,'operator<(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82e21f74ab115cb8d8b130ea0aa38de1',1,'operator<(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29dfd373e87547b2189a785bdd2d2d30',1,'operator<(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e3ceeaa992b5389d70a970e723ebcb6',1,'operator<(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47537c956d1de80e0957697c5cfc5807',1,'operator<(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a1be1cc49d4cecd7a5429de37a81150',1,'operator<(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga27ccf7cfaefc9b9bb196d6134d514954',1,'operator<(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a7cbda5c7b76068d44b423ba3180197',1,'operator<(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8c2178181fbb679c4b0a9917b037d6',1,'operator<(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5302aa2958867fbe5d6103d02587c42',1,'operator<(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5c4b2c41ed0b03aa208217b10ecd153',1,'operator<(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga273e57446ed81c0483ba887dd3f93acd',1,'operator<(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga954fbd581d81f4a0f22937b67cf4bd1a',1,'operator<(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga810f78c5aa99e7921f2acb3369662ea8',1,'operator<(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99b41f158893fb62ff2ec68aa59e1fe8',1,'operator<(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ba0f960fc417bb64c06b91985160306',1,'operator<(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a0fea95e1138b1be0462bfd06d39e21',1,'operator<(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac69d2269b390083983094fc05522d3e4',1,'operator<(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga502b1092946623165164f1eb3db5ec13',1,'operator<(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacbd2df713f63e213f3c935942f8b789d',1,'operator<(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1cd8a0ab74fe1776ba27691cb9dc0bb1',1,'operator<(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad0dfcd65770b6f6f97c624b03b456219',1,'operator<(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1c5fb881e5d825b65978c18468c2aa',1,'operator<(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a482c5969940a7c6039aaaa365f1bc2',1,'operator<(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabcc2b224af30927d91ccc96465940505',1,'operator<(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e887a468977d874479b527d09649134',1,'operator<(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf9ee2e0ba4e219c9fd9f181a7a7e7829',1,'operator<(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace7961c4f78672879296988127017dc7',1,'operator<(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8eb96b9fa9eb4cfd5063728a52752c92',1,'operator<(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20019500f5925231a8e453e066061b56',1,'operator<(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef934652424e05dd36af802f8f463631',1,'operator<(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fd192ad18d856a0df0189ac2df19e42',1,'operator<(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga395ea80af7d2745dab132bbdaa9d3894',1,'operator<(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76bda195f33e2574a6c60450460c5e14',1,'operator<(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07693623464c75318cf0dc62902993c9',1,'operator<(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b93fe9997af973d95ce09182e6f83cd',1,'operator<(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56a8ddd35f97a00f47f1c58174be300d',1,'operator<(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd969c3c0fae8b79b41eb91e215a0f6c',1,'operator<(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae23831834eef58d15594a6de775cb097',1,'operator<(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae335ff1785c5c99e207d81955d320243',1,'operator<(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga587f8bd580b1cbf02d82319eee32cac9',1,'operator<(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e02a23a9900338a83321e93d6cb849',1,'operator<(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga123f05595c78e1eb9c5ae4af2df3fedf',1,'operator<(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b933d7e73b54df55090a05d233e76ed',1,'operator<(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab81a6520e9c56086d5938319b47f5ee4',1,'operator<(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52733db0ac977cc46e56471cb549a6f4',1,'operator<(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24c3d47e3e73e50e6a7c94175a0779a2',1,'operator<(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga972d5282ac2202923f870ea8bb918140',1,'operator<(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e4eca8de66ce6c3006c8c83dca5b83e',1,'operator<(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd9e7ebda1d8aad9ca5b6dca517b019e',1,'operator<(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf952eaa3fb132711c2f6ba89ebdd98b7',1,'operator<(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga098db186cca858509dc51d532b5d7564',1,'operator<(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5a1be5b2b49f5e029ec733450ce10fbd',1,'operator<(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga579e4cccc35c306c9bed75e01586aa9d',1,'operator<(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfff9bd4dde1a4bb8e90b7c15e3a3bc1',1,'operator<(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfdd8113fc7213a912edfcb42071db45',1,'operator<(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b13aeb71dbcf00af868786d733cb6b8',1,'operator<(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga364d06fad2cedd8ea6ead77708f6872a',1,'operator<(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf19430d38270527b027e367dd8f75374',1,'operator<(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48f6f225dc0f298b4550e3bee2922237',1,'operator<(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e9cb1782ba4f252f4bf7faa67e37a9f',1,'operator<(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab94129d6207f24868de8cb10ea14e103',1,'operator<(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga97bcaa50d0526305b450eb7388e30e79',1,'operator<(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae41ad1e69567d7b71a7e5d251f5105b9',1,'operator<(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga47873f124d86cc20cc38b12aad2822a7',1,'operator<(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga01a12a1d99cffc29b3a5d722a3bc24eb',1,'operator<(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa774569fab758f87ea2f32da59541701',1,'operator<(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e852a418f5730b03e7b2cee91cf78f5',1,'operator<(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bc4c0b02d2261a0a8f073ea42012509',1,'operator<(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac42d55945bb2f549eac6b422d70134e9',1,'operator<(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b8bf0a9ddf12f5978fa840bbb1281c1',1,'operator<(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fe6f82b9b2d38747c4d07bdd384d344',1,'operator<(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05d714d19bf702199d8bd7e008d8549c',1,'operator<(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga54d0a4a5dc2a8b97726c52d724cd7de4',1,'operator<(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9d3a1bb44b76d738543a582e2178ebb',1,'operator<(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3355798174802823946fd7d843d11e6e',1,'operator<(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572769430e10effec5056d6df7efa16c',1,'operator<(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ad33b110711b4827718cfef458d5ed7',1,'operator<(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac72dfaedbb3a827ed78228af321574a1',1,'operator<(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75730e1d5cede97eb4faf4f1bd833227',1,'operator<(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e43019fba0109832ea5b5f74e1e92ff',1,'operator<(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac46443ae5909e3a5066c06f208610caf',1,'operator<(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae85889915d683c12e077cb4ec5083c2e',1,'operator<(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga479ccee369fff799ced2c404cec35be7',1,'operator<(const Match &rhs) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a322f7449964a51cfe95142e14db0ef72',1,'__gnu_cxx::operator<(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ad7d9e389800dcea7b1748d08f70f0358',1,'__gnu_cxx::operator<(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#afdc865f8e1dd5fb8be54c6a608d6ca17',1,'__gnu_cxx::operator<(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a53d215eee36632ee43c5039c54d648ae',1,'std::operator<(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7d32b48a9dc0ee1316aedbde00a1a8fd',1,'std::operator<(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga69e152dbea8e3ca77b307634084fb164',1,'std::operator<(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a203ef17a8b706e78acfa3d05f30e20ca',1,'std::operator<(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7f56f6da4d4f20444cbbab54a95e99e5',1,'std::operator<(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gad9079e03d834c2dfd61dfae4f73f0031',1,'std::operator<(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga341b35e5b4af405e08d5c2abb676cf39',1,'std::operator<(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a64f0c6157f108a5bfe4ac5096e5bc4b2',1,'std::operator<(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20182f0fe24d991ad8a8daede16933fa',1,'std::operator<(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga11e1ee39f1b05e646abe2caea0565967',1,'std::operator<(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga01622c3d750044cf92cd8a1eaa89ca5b',1,'std::operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1862d7e70ac15663db23831edbc4d06f',1,'std::operator<(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5e86344cdca451bac42e9d9936e99353',1,'std::operator<(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a3cbf6143f4ce61b7174408e06a4181f0',1,'std::operator<(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gabc00ef86c05a9226d2007dd587c196f3',1,'std::operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8fcefae1f44d9e5656f2231d04742454',1,'std::operator<(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7b31ae4487ff01fcb215071c0f521caa',1,'std::operator<(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a15c710c3bf507d1a7bdf5f8de40cafe2',1,'std::operator<(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa0eb871a6a5db29c6fa9c682b7808bdd',1,'std::operator<(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a27a4470c800ce13f6c1220c5ec11c360',1,'std::operator<(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5a6f7a1317ae28e6f2b71a0497873e25',1,'std::operator<(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gad9079e03d834c2dfd61dfae4f73f0031',1,'operator<(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga341b35e5b4af405e08d5c2abb676cf39',1,'operator<(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20182f0fe24d991ad8a8daede16933fa',1,'operator<(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga11e1ee39f1b05e646abe2caea0565967',1,'operator<(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga01622c3d750044cf92cd8a1eaa89ca5b',1,'operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1862d7e70ac15663db23831edbc4d06f',1,'operator<(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gabc00ef86c05a9226d2007dd587c196f3',1,'operator<(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga69e152dbea8e3ca77b307634084fb164',1,'operator<(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], + ['operator_3c_3c_118',['operator<<',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a5d64e1a22e8e659de99a027f66bf26bc',1,'cv::FileStorage::operator<<(FileStorage &fs, const String &str)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a84431fd1b5075275f5c3407dc58b36ae',1,'cv::FileStorage::operator<<(FileStorage &fs, const _Tp &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#acdfed1145ad6cc92e20975596c7b8bed',1,'cv::FileStorage::operator<<(FileStorage &fs, const char *str)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae1a501b3d13d8fd3de1b7299926a02cd',1,'cv::FileStorage::operator<<(FileStorage &fs, char *value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a84431fd1b5075275f5c3407dc58b36ae',1,'cv::FileStorage::operator<<(FileStorage &fs, const _Tp &value)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#acdfed1145ad6cc92e20975596c7b8bed',1,'cv::FileStorage::operator<<(FileStorage &fs, const char *str)'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#ae1a501b3d13d8fd3de1b7299926a02cd',1,'cv::FileStorage::operator<<(FileStorage &fs, char *value)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#a674a3009537b05a655ad483acd8e09eb',1,'cv::VideoWriter::operator<<(const Mat &image)'],['https://docs.opencv.org/4.2.0/dd/d9e/classcv_1_1VideoWriter.html#ad9a866bd422a46216993e8015f8f68cf',1,'cv::VideoWriter::operator<<(const UMat &image)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'basic_iostream< char >::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'basic_iostream< char >::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_iostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_iostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_iostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_iostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_iostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_iostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_iostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_iostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_iostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_iostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_iostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_iostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_iostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_iostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_iostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_iostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_iostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_iostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_iostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_iostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_iostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_iostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_iostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_iostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_iostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_iostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_iostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_iostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_iostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_iostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'basic_ostream< char >::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'basic_ostream< char >::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'basic_ostream< char, _Traits >::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'basic_ostream< char, _Traits >::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char, _Traits >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char, _Traits >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char, _Traits >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char, _Traits >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char, _Traits >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char, _Traits >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char, _Traits >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char, _Traits >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char, _Traits >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char, _Traits >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char, _Traits >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char, _Traits >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char, _Traits >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char, _Traits >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char, _Traits >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'basic_ostream< char, _Traits >::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'basic_ostream< char, _Traits >::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'basic_ostream< char, _Traits >::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'basic_ostream< char, _Traits >::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'basic_ostream< char, _Traits >::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'basic_ostream< char, _Traits >::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'basic_ostream< char, _Traits >::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'basic_ostream< char, _Traits >::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'basic_ostream< char, _Traits >::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'basic_ostream< char, _Traits >::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'basic_ostream< char, _Traits >::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'basic_ostream< char, _Traits >::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'basic_ostream< char, _Traits >::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'basic_ostream< char, _Traits >::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'basic_ostream< char, _Traits >::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_fstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_fstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_fstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_fstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_fstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_fstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_fstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_fstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_fstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_fstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_fstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_fstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_fstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_fstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_fstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_fstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_fstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_fstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_fstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_fstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_fstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_fstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_fstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_fstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_fstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_fstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_fstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_fstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_fstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_fstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_fstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_fstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_iostream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_iostream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_iostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_iostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_iostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_iostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_iostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_iostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_iostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_iostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_iostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_iostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_iostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_iostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_iostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_iostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_iostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_iostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_iostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_iostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_iostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_iostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_iostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_iostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_iostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_iostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_iostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_iostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_iostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_iostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_iostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_iostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_ofstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_ofstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ofstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ofstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ofstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ofstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ofstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ofstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ofstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ofstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ofstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ofstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ofstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ofstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ofstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ofstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ofstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ofstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ofstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ofstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ofstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ofstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ofstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ofstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ofstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ofstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ofstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ofstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ofstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ofstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ofstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ofstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_ostream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_ostream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_ostringstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_ostringstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_ostringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_ostringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_ostringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_ostringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_ostringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_ostringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_ostringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_ostringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_ostringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_ostringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_ostringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_ostringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_ostringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_ostringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_ostringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a55c3406610bedc51adf69c5bf5e91f87',1,'std::basic_stringstream::operator<<(const void *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ae44501375408f184570a51b04f9f984c',1,'std::basic_stringstream::operator<<(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_stringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_stringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_stringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_stringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_stringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_stringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_stringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_stringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_stringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_stringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_stringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_stringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_stringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_stringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_stringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a41d3f54557efcf4cb17bf28dfeb8f8b7',1,'std::basic_stringstream::operator<<(__ostream_type &(*__pf)(__ostream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4dba8118cd693690803dbc5bbef6a96d',1,'std::basic_stringstream::operator<<(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#ac00d04322df723ab0315f3675083af96',1,'std::basic_stringstream::operator<<(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a668a5b41a1fb9d5b71e1969c789dd77d',1,'std::basic_stringstream::operator<<(long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a5cb03728cf9eab9a6d4c287f05c56fd4',1,'std::basic_stringstream::operator<<(unsigned long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#aa10cfb65258b9cbf3ef00f3d6a3402c7',1,'std::basic_stringstream::operator<<(bool __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2bf303db0f61e6c34b99cd57ea7b143c',1,'std::basic_stringstream::operator<<(short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a2b5b079df15919cebcfc5ff9b54135cd',1,'std::basic_stringstream::operator<<(unsigned short __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a90608b96fbe83830a71760b741ae3159',1,'std::basic_stringstream::operator<<(int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8542f053d889b3ab9ed7c04675cc1c20',1,'std::basic_stringstream::operator<<(unsigned int __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a80972d7d1092482b04c0f03ffdab4da3',1,'std::basic_stringstream::operator<<(long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a0e819fe2a2afdfc76f4c3bd0c3b0dfea',1,'std::basic_stringstream::operator<<(unsigned long long __n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a88dff73954faa7d6515aefaa7557b5cd',1,'std::basic_stringstream::operator<<(double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a4af9ee104ee5f19064dce282a9b4bf24',1,'std::basic_stringstream::operator<<(float __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02459.html#a8a099fe4d893ccbd86e6dc96a44e3135',1,'std::basic_stringstream::operator<<(long double __f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a725f2ea3af449e1e3286300e694d863d',1,'std::bitset::operator<<(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a725f2ea3af449e1e3286300e694d863d',1,'std::bitset::operator<<(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a436906ba9f65924c521aba3f4c981616',1,'std::tr2::dynamic_bitset::operator<<(size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a436906ba9f65924c521aba3f4c981616',1,'std::tr2::dynamic_bitset::operator<<(size_type __pos) const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'Eigen::DenseBase::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'Eigen::DenseBase::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'Eigen::DenseBase::operator<<(std::ostream &s, const DenseBase< Derived > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator<<(std::ostream &s, const DenseBase< ArrayWrapper< ExpressionType > > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator<<(std::ostream &s, const DenseBase< Homogeneous< MatrixType, _Direction > > &m)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0f0e34696162b34762b2bf4bd948f90c',1,'DenseBase< Solve< Decomposition, RhsType > >::operator<<(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0e575eb0ba6cc6bc5f347872abd8509d',1,'DenseBase< Solve< Decomposition, RhsType > >::operator<<(const Scalar &s)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a3806d3f42de165878dace160e6aba40a',1,'DenseBase< Solve< Decomposition, RhsType > >::operator<<(std::ostream &s, const DenseBase< Solve< Decomposition, RhsType > > &m)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#abadf4e6fb19d70207d8e5600747b8c2c',1,'cv::operator<<(std::ostream &os, const GMetaArg &)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a83a3132a9b08145ceb61a56eb1abcd11',1,'cv::operator<<(std::ostream &os, const cv::GArrayDesc &desc)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#a0c9fa53616ecd94efd7e9359dd439cb0',1,'cv::operator<<(std::ostream &os, const cv::GScalarDesc &desc)'],['https://docs.opencv.org/4.2.0/d2/d75/namespacecv.html#aa078055dbff233794a73da855cdd1288',1,'cv::operator<<(std::ostream &os, const cv::GMatDesc &desc)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5cdb7018d77509d22194d74f8e066f4c',1,'cv::operator<<(std::ostream &out, const TickMeter &tm)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacef821c50106276406bf4bc1cd7a059a',1,'cv::operator<<(const v_reg< _Tp, n > &a, int imm)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf47f069bbc73929ec5fd73ce9947339a',1,'cv::operator<<(String &out, Ptr< Formatted > fmtd)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3557054d1f0f079cf5e60a44851e4c70',1,'cv::operator<<(String &out, const Mat &mtx)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89d6a7eb3b4253c351bdd5c87bd6e15c',1,'cv::cudev::operator<<(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac309e654bf56a92bce54257f60224978',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37724ee1b2714aa21d8333bdd0b60332',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d89446b9cd1b84d4c54b3626ea797dd',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23de5acc1ec45d07a00fe8f37f7f2702',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2526c7f52b4492a5c8f41c30b2f21de',1,'cv::cudev::operator<<(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdab9d7d458a6819636e2031176dbf19',1,'cv::cudev::operator<<(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf98ccc0340ec81f52ec4c4079978a10a',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fbe62deadc03136397368ef9858f6f7',1,'cv::cudev::operator<<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf970863271a297e3197d7f9d1c6fba2c',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5141661e7abfe6f695104cd2f80199cc',1,'cv::cudev::operator<<(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa02b5451a03bbfe3fb34a0997e2c337f',1,'cv::cudev::operator<<(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca5eab3b992fbcf25f4089bd19ba2d80',1,'cv::cudev::operator<<(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e6980cc8c55e7d4d2a6b543d5ea145d',1,'cv::cudev::operator<<(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6a5b89d72294aa4f962767ee2fc0537',1,'cv::cudev::operator<<(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5184147f1ae14d34ebe791b02bb23617',1,'cv::cudev::operator<<(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac84a8246095fdb1ee004cff3802ab4e0',1,'cv::cudev::operator<<(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83575e7f013d7c113a991948c4b65314',1,'cv::cudev::operator<<(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga342190a6ce5ef956b5b54a8f9b2c7317',1,'cv::cudev::operator<<(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32b6410f888d77e0bd160d6fe83824',1,'cv::cudev::operator<<(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e299bf0650ac5d0f894ac165109e219',1,'cv::cudev::operator<<(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b494e6b58845e60c37350325d48268',1,'cv::cudev::operator<<(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f12be0b00cb28aa3a721b8dc96c9bc',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga519fefe984648ac2ccb3778d3ed0b48b',1,'cv::cudev::operator<<(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/d57/namespacecv_1_1dnn.html#a848acecc1b2682cf97f8da363569e24f',1,'cv::dnn::operator<<()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a41e9a5ded43842da10ea7875e9d9a1aa',1,'cv::gapi::own::operator<<(std::ostream &o, const Rect &rect)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#ad54ba083ef5d8b00875c97b457341dc9',1,'cv::gapi::own::operator<<(std::ostream &o, const Size &s)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#gaf47f069bbc73929ec5fd73ce9947339a',1,'operator<<(String &out, Ptr< Formatted > fmtd)(Global Namespace)'],['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html#ga3557054d1f0f079cf5e60a44851e4c70',1,'operator<<(String &out, const Mat &mtx)(Global Namespace)'],['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#ga5cdb7018d77509d22194d74f8e066f4c',1,'operator<<(std::ostream &out, const TickMeter &tm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gacef821c50106276406bf4bc1cd7a059a',1,'operator<<(const v_reg< _Tp, n > &a, int imm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89d6a7eb3b4253c351bdd5c87bd6e15c',1,'operator<<(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac309e654bf56a92bce54257f60224978',1,'operator<<(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37724ee1b2714aa21d8333bdd0b60332',1,'operator<<(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d89446b9cd1b84d4c54b3626ea797dd',1,'operator<<(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23de5acc1ec45d07a00fe8f37f7f2702',1,'operator<<(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2526c7f52b4492a5c8f41c30b2f21de',1,'operator<<(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdab9d7d458a6819636e2031176dbf19',1,'operator<<(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf98ccc0340ec81f52ec4c4079978a10a',1,'operator<<(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fbe62deadc03136397368ef9858f6f7',1,'operator<<(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf970863271a297e3197d7f9d1c6fba2c',1,'operator<<(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5141661e7abfe6f695104cd2f80199cc',1,'operator<<(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa02b5451a03bbfe3fb34a0997e2c337f',1,'operator<<(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca5eab3b992fbcf25f4089bd19ba2d80',1,'operator<<(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e6980cc8c55e7d4d2a6b543d5ea145d',1,'operator<<(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac6a5b89d72294aa4f962767ee2fc0537',1,'operator<<(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5184147f1ae14d34ebe791b02bb23617',1,'operator<<(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac84a8246095fdb1ee004cff3802ab4e0',1,'operator<<(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83575e7f013d7c113a991948c4b65314',1,'operator<<(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga342190a6ce5ef956b5b54a8f9b2c7317',1,'operator<<(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c32b6410f888d77e0bd160d6fe83824',1,'operator<<(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e299bf0650ac5d0f894ac165109e219',1,'operator<<(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b494e6b58845e60c37350325d48268',1,'operator<<(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34f12be0b00cb28aa3a721b8dc96c9bc',1,'operator<<(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga519fefe984648ac2ccb3778d3ed0b48b',1,'operator<<(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8f7159a55b4df5308fa03b531586fb2b',1,'std::operator<<(std::basic_ostream< _Ch, _Tr > &__os, const __shared_ptr< _Tp, _Lp > &__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga2ba7b3cbabd5345e19d26796f766c6c0',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__os, const complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8d0f4660661dc80ee079bdfa88eebd2b',1,'std::operator<<(_Ostream &&__os, const _Tp &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga1e56f8bee410b0ebf924661d35faf834',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga3e80f96ee978fcba07dec04a3d9e1f3b',1,'std::operator<<(basic_ostream< _Ch_type, _Ch_traits > &__os, const sub_match< _Bi_iter > &__m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#ga268e36f52e1a1ba938eeaa95509796ca',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_int_distribution< _IntType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gad31a64335591da810bc4719b847783ec',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_real_distribution< _RealType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac4faea5494eaad9201d45d8687792782',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__os, const __gnu_cxx::__versa_string< _CharT, _Traits, _Alloc, _Base > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabc0fe37b26c3b5de242cd4261cde3aed',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::cauchy_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga17d284660a1656bc205dd834125e5543',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::bernoulli_distribution &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga50ccdd252598b9c017837d26588463d2',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::geometric_distribution< _IntType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga24847f7a1a655893e956f636db4e9f3a',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::exponential_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5d78bcb5583afa9e1871301f9d6d9c68',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::weibull_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga65897cd1a592c0a6c399072ec1ef7192',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::extreme_value_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7ce367a2dac030dcf212d89846f6c6ff',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__os, const basic_string< _CharT, _Traits, _Alloc > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a20aaa750b7ddf43635768c7b2d0385e6',1,'std::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const bitset< _Nb > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4162d00742462ffb4e5b792edd81e594',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, _CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afe8641d2d416e2c56bae3ae4294de5f9',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abb2dcd26142d2d22961a30d8407161be',1,'std::operator<<(basic_ostream< char, _Traits > &__out, char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a105a937bc8d1394e0bb683dea33b9f1b',1,'std::operator<<(basic_ostream< char, _Traits > &__out, signed char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4b69f99d144efda14d0e97f2eda925a7',1,'std::operator<<(basic_ostream< char, _Traits > &__out, unsigned char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6c05be9ccf056df69e524be5751af66b',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa6c746960bcd91f0e547628fb5f04cde',1,'std::operator<<(basic_ostream< _CharT, _Traits > &__out, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6d6a581dcdff7c878cd963e5f14c0c56',1,'std::operator<<(basic_ostream< char, _Traits > &__out, const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af3b2cf95d3db957b00a07c89c708fee2',1,'std::operator<<(basic_ostream< char, _Traits > &__out, const signed char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9d1f9961c2210c515937937c3a75b28e',1,'std::operator<<(basic_ostream< char, _Traits > &__out, const unsigned char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html#a75a3eb00bb313c120599e8341bf27d16',1,'std::__detail::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const _Quoted_string< _String, _CharT > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html#a5e78e46b4d59d40bf8839a5cb176fa6a',1,'std::__detail::operator<<(std::basic_ostream< _CharT, _Traits > &__os, const _Quoted_string< const _CharT *, _CharT > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gaf5eb3c897d120abd3981d431b0c57b35',1,'std::tr2::operator<<()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga17d284660a1656bc205dd834125e5543',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::bernoulli_distribution &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga50ccdd252598b9c017837d26588463d2',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::geometric_distribution< _IntType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga2ba7b3cbabd5345e19d26796f766c6c0',1,'operator<<(basic_ostream< _CharT, _Traits > &__os, const complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gaf5eb3c897d120abd3981d431b0c57b35',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const dynamic_bitset< _WordT, _Alloc > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#gabc0fe37b26c3b5de242cd4261cde3aed',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::cauchy_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01481.html#ga8f7159a55b4df5308fa03b531586fb2b',1,'operator<<(std::basic_ostream< _Ch, _Tr > &__os, const __shared_ptr< _Tp, _Lp > &__p)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga24847f7a1a655893e956f636db4e9f3a',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::exponential_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5d78bcb5583afa9e1871301f9d6d9c68',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::weibull_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga65897cd1a592c0a6c399072ec1ef7192',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::extreme_value_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01541.html#ga1e56f8bee410b0ebf924661d35faf834',1,'operator<<(std::basic_ostream< _CharT, _Traits > &__os, const std::independent_bits_engine< _RandomNumberEngine, __w, _UIntType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga3e80f96ee978fcba07dec04a3d9e1f3b',1,'operator<<(basic_ostream< _Ch_type, _Ch_traits > &__os, const sub_match< _Bi_iter > &__m)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#ga268e36f52e1a1ba938eeaa95509796ca',1,'operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_int_distribution< _IntType > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gad31a64335591da810bc4719b847783ec',1,'operator<<(std::basic_ostream< _CharT, _Traits > &, const std::uniform_real_distribution< _RealType > &)(Global Namespace)']]], + ['operator_3c_3c_3d_119',['operator<<=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac36920b534a80be4cc1e6e80c68d2be5',1,'std::bitset::operator<<=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac36920b534a80be4cc1e6e80c68d2be5',1,'std::bitset::operator<<=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga30a493dbd85a2271bcc09d9d24f387b2',1,'std::gslice_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga43fc95bcbd0f89c0468f249209eb587b',1,'std::indirect_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gadc9fb4be42ab111a8b17efc9480006c7',1,'std::mask_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga15a72598162a7183c3be5cfdcb43a94b',1,'std::slice_array::operator<<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a0052dae6eec21a15abee0bb7f339611d',1,'std::tr2::dynamic_bitset::operator<<=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a0052dae6eec21a15abee0bb7f339611d',1,'std::tr2::dynamic_bitset::operator<<=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga435a2811affb685f15934a9204bed29e',1,'std::valarray::operator<<=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9635c78d05a1fcbc22885223c1432f25',1,'std::valarray::operator<<=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga435a2811affb685f15934a9204bed29e',1,'valarray< size_t >::operator<<=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga9635c78d05a1fcbc22885223c1432f25',1,'valarray< size_t >::operator<<=(const valarray< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga30a493dbd85a2271bcc09d9d24f387b2',1,'operator<<=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga435a2811affb685f15934a9204bed29e',1,'operator<<=(const _Tp &)(Global Namespace)']]], + ['operator_3c_3d_120',['operator<=',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a630e58dd233abf6b6ff3393be67454c0',1,'cv::MatExpr::operator<=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abeea3d9de568017193b26eea645c98f3',1,'cv::MatExpr::operator<=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a21b436ed46cb4ec5a3628576a10190fe',1,'cv::MatExpr::operator<=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0a628b41fded09b2e899b46836590de3',1,'cv::MatExpr::operator<=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8a039003baebfa48ba24de81f7f4d931',1,'cv::MatExpr::operator<=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a630e58dd233abf6b6ff3393be67454c0',1,'cv::MatExpr::operator<=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abeea3d9de568017193b26eea645c98f3',1,'cv::MatExpr::operator<=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a21b436ed46cb4ec5a3628576a10190fe',1,'cv::MatExpr::operator<=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0a628b41fded09b2e899b46836590de3',1,'cv::MatExpr::operator<=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8a039003baebfa48ba24de81f7f4d931',1,'cv::MatExpr::operator<=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaa804bf096018d007e2a7894cdb98037a',1,'cv::softdouble::operator<=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6c17bb1577e0284585be0ba580811e8f',1,'cv::softfloat::operator<=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga02b1b9dcfcefdfb34dadf0cd35ba61a3',1,'cv::operator<=()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1ead1ff269aa97694b6497d29e1e29c',1,'cv::cudev::operator<=(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa62bc6367673e025ae709593a9b656e5',1,'cv::cudev::operator<=(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23f1ab559dd9692502ce026417f45408',1,'cv::cudev::operator<=(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78bf3eb6d82e42dc66cf49fb78f79231',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19f33206e415060c1a0ea1eb3000d96b',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffe8680754ff4aa69ba039a79faf6626',1,'cv::cudev::operator<=(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1da871666d7dd2e618b145e8864929e8',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga701bfc015fbda0963f2803b27aca4d33',1,'cv::cudev::operator<=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff9c454089fcf80143cd32fa50238fcd',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23bf29cabff89d8549d818ef43147c14',1,'cv::cudev::operator<=(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga296d4d026d70f8f76aab066328f3d3fa',1,'cv::cudev::operator<=(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45ca16669f94b285db4334a262f80063',1,'cv::cudev::operator<=(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22e88dd408d2e5cff64faeab249681ba',1,'cv::cudev::operator<=(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a750fb20efa2f5a06000ccf33cd759b',1,'cv::cudev::operator<=(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ce34596d222bf804c1e9bf7e3d1243',1,'cv::cudev::operator<=(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11bdd191156ebdab62005a519b325200',1,'cv::cudev::operator<=(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b2b32ec5290e7e12efc0856bd5f743',1,'cv::cudev::operator<=(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf04bc7968693077bc7d4f2823645b88e',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga008bc5070a5b0e4af5cf5191f5d6b9d6',1,'cv::cudev::operator<=(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a9a3aa7951e9c0e8d8adfbda9a72209',1,'cv::cudev::operator<=(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga818519c31a2652549a00cd4d7393d79e',1,'cv::cudev::operator<=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab796146ad2e11416ac65fba37c0b8625',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07ebffec69ff52e0b06760664c1f6734',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadb89b24d295438f54277d245ece9366',1,'cv::cudev::operator<=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fc00541a0243c34358a3bf00f4da05a',1,'cv::cudev::operator<=(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90197d0db673130bc8a100773411d4bd',1,'cv::cudev::operator<=(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7e43a07a9aa0a10c8d37116f06bd9a',1,'cv::cudev::operator<=(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc2939c217e196e51ecd1b2a3e06c153',1,'cv::cudev::operator<=(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fe4a35b631b3aaa2e0e857bcbbd6bad',1,'cv::cudev::operator<=(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae309099345eee12887e40f5b0b050f3e',1,'cv::cudev::operator<=(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad102af955636969a42dbffc6dbb01b46',1,'cv::cudev::operator<=(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc0e7fca81b7c89968d39d89dc649b7a',1,'cv::cudev::operator<=(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21fc2950b93de4f956fbaf0758feb6a1',1,'cv::cudev::operator<=(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d7b36c9336f6fc1a843e54c4df8f0e',1,'cv::cudev::operator<=(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41851377c29b820cf0506e6a0e709782',1,'cv::cudev::operator<=(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12057494f0e2df897df3fc9841779e4d',1,'cv::cudev::operator<=(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10792a96e7eb2e17bb8163ef90a323b4',1,'cv::cudev::operator<=(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7fbfe98286073cd2a5660902a39f04',1,'cv::cudev::operator<=(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a1bebcff32a1bf7d2575d05bfeb7890',1,'cv::cudev::operator<=(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff6fe97435e41e89de0bdef31594a96',1,'cv::cudev::operator<=(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa56d3d64ea9d3eb351f5df4712c7d56f',1,'cv::cudev::operator<=(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468b559ecf6624521e1c1dd45ef6d2e6',1,'cv::cudev::operator<=(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc5c1c549707034c570459ffee3e806',1,'cv::cudev::operator<=(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9643b2618b16b6ab86f270012d70212a',1,'cv::cudev::operator<=(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788e492c5f919e8367629179e2524611',1,'cv::cudev::operator<=(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb572141a492105ee211ba7c12d0777',1,'cv::cudev::operator<=(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5db9beb4e23e8a160a22aa678720a87',1,'cv::cudev::operator<=(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bed66c4065e1f21bc76995bfa99752b',1,'cv::cudev::operator<=(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e90fe2cf3b8c107bfe31aa0b2f94e3c',1,'cv::cudev::operator<=(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga576e04d2f78108d39b4461fcf6aded03',1,'cv::cudev::operator<=(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0c263dc40917991d1a7039432d3d4f9',1,'cv::cudev::operator<=(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5edc4d4087d24b678e8daf4926370ea',1,'cv::cudev::operator<=(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13f7090565e4f7e704870536ed987057',1,'cv::cudev::operator<=(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cd1eaa84e6d908ae0e907de12fdcde9',1,'cv::cudev::operator<=(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga375fc5f28c2b1e5962243287a28e5b58',1,'cv::cudev::operator<=(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab9131041d6fc4ae7360291aee9b26',1,'cv::cudev::operator<=(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f106914932b4cab06413eb2632ef2cd',1,'cv::cudev::operator<=(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04227753f6db79fdbfb9715240961a97',1,'cv::cudev::operator<=(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12191665fdc650dbf8500db71892fd0',1,'cv::cudev::operator<=(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1001c72e6391934b7daaf15c66ab0d7',1,'cv::cudev::operator<=(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75483e6deab8535ed86eb6dc65947e0f',1,'cv::cudev::operator<=(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72810c269851aae026716559fa2af537',1,'cv::cudev::operator<=(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14aafc9b0e4ab5e8090d0ac9a679583',1,'cv::cudev::operator<=(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23d29f809003619e6d82b5b7ea7de995',1,'cv::cudev::operator<=(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd09b7cc4b4786532fda053066dcbafd',1,'cv::cudev::operator<=(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31edb90c4322609ec771e66e4583739e',1,'cv::cudev::operator<=(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33819e2576485dff43ab99ca0e19560e',1,'cv::cudev::operator<=(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b66f84f7275665c91b9fed5aed59be5',1,'cv::cudev::operator<=(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35728a641902e5d67a7531342d2d43a1',1,'cv::cudev::operator<=(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e1e3238a8f002f82a398ca042d3db2',1,'cv::cudev::operator<=(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37b679d33d766b5ce00013e7c96fc4c',1,'cv::cudev::operator<=(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56fd29329dd70b608a25f8f8b462562f',1,'cv::cudev::operator<=(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92c40110cfc6a7a10651b46b15c7533e',1,'cv::cudev::operator<=(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b2a3a801109a2a06e5da8675728fe58',1,'cv::cudev::operator<=(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga250eb7cdcb64312f4e2641501dc9baee',1,'cv::cudev::operator<=(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f0089cb1db00710fd7233770bc30b60',1,'cv::cudev::operator<=(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef2bba33802f57daa91e22602079a3a7',1,'cv::cudev::operator<=(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c460da93b4a465dbb65ea6c98d08e0',1,'cv::cudev::operator<=(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247f899b55928b075fc919076f5e5949',1,'cv::cudev::operator<=(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga914be25957de16f44b85396ba88a7f5d',1,'cv::cudev::operator<=(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e5a6258674087258ec46bf94c668353',1,'cv::cudev::operator<=(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2dbc819cf82263e9ec490552404734',1,'cv::cudev::operator<=(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eff31462c5876d989bad00f346ab183',1,'cv::cudev::operator<=(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03fe55d350f74009fef23cbf85c265c4',1,'cv::cudev::operator<=(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad73033b2ed798b55ac0e978547e2dcdd',1,'cv::cudev::operator<=(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08dfbf27c72c08bc5b257948694cc3e1',1,'cv::cudev::operator<=(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7460f2ca99c07231e71c964b4b584ac',1,'cv::cudev::operator<=(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b414d7742537f5def6a1f1dbbcee688',1,'cv::cudev::operator<=(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a1f07e6149542f2488750c2af3c068',1,'cv::cudev::operator<=(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc181ce10142dbd76ee1376a3cd90fdd',1,'cv::cudev::operator<=(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40b2bb5b5a77fa89913fb57853cde453',1,'cv::cudev::operator<=(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac06f6f101ec8cfcaf490ec6f041a837f',1,'cv::cudev::operator<=(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8e0bfab992ab8a121c15af1e82829ac',1,'cv::cudev::operator<=(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e24ea99fa24b52f3669e40c16c2a0f7',1,'cv::cudev::operator<=(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1e079957fbf820718af8a90067d68a9',1,'cv::cudev::operator<=(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93b6391a06707b6be2ca59da57057086',1,'cv::cudev::operator<=(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61706e65d948e11d869534a6653c00bf',1,'cv::cudev::operator<=(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99abc45e21e9f42fd926a8e83cdab296',1,'cv::cudev::operator<=(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba541b96bbc1af333e8a13eb1dc169d',1,'cv::cudev::operator<=(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7a9638a0e70f17231a9e10fecedb0b2',1,'cv::cudev::operator<=(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga455fe5a0dbcd6e20648e5bc2dd13fd6c',1,'cv::cudev::operator<=(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2618b57557803d2ac6d3450904bf7e6',1,'cv::cudev::operator<=(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ad206b773be555181e771e60d3d80d',1,'cv::cudev::operator<=(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2589f700026397ad0058d21462da1714',1,'cv::cudev::operator<=(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac57dc63fcc9e6782a2af19c0a14bf769',1,'cv::cudev::operator<=(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5f991c778ac1f18cd26ec9a6ae5ff72',1,'cv::cudev::operator<=(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7a1cc2de07b5b85ef8a5b16d01e487b',1,'cv::cudev::operator<=(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa452eeb5d53100bd938b7e1bb338d995',1,'cv::cudev::operator<=(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987b56ea0c72d063c0556dd6cac14929',1,'cv::cudev::operator<=(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9292c118b4add3d2e427413547c585fb',1,'cv::cudev::operator<=(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546cd23c9536ca329dbc1c6cccb7497',1,'cv::cudev::operator<=(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ec0c62ac154d66d9623f15fdac7c91',1,'cv::cudev::operator<=(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f767e3bf13cbd06503128dae485024',1,'cv::cudev::operator<=(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e42dbf144296f0d9586569a04f490',1,'cv::cudev::operator<=(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga616315867d4da80fdfe8216599b6537e',1,'cv::cudev::operator<=(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92fbe24a4d7fc8e87ea5663cad49fcf1',1,'cv::cudev::operator<=(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73c4504f2ad38a1eb98bcf0da9989196',1,'cv::cudev::operator<=(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga525f070d7c6ab195d7c415794a412214',1,'cv::cudev::operator<=(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb29143e8afd81a0c0f520bb43c16b6',1,'cv::cudev::operator<=(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cb74c8f5ee39656481d92ba33911254',1,'cv::cudev::operator<=(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga6c17bb1577e0284585be0ba580811e8f',1,'operator<=(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaa804bf096018d007e2a7894cdb98037a',1,'operator<=(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga02b1b9dcfcefdfb34dadf0cd35ba61a3',1,'operator<=(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1ead1ff269aa97694b6497d29e1e29c',1,'operator<=(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa62bc6367673e025ae709593a9b656e5',1,'operator<=(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23f1ab559dd9692502ce026417f45408',1,'operator<=(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78bf3eb6d82e42dc66cf49fb78f79231',1,'operator<=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19f33206e415060c1a0ea1eb3000d96b',1,'operator<=(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaffe8680754ff4aa69ba039a79faf6626',1,'operator<=(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1da871666d7dd2e618b145e8864929e8',1,'operator<=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga701bfc015fbda0963f2803b27aca4d33',1,'operator<=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff9c454089fcf80143cd32fa50238fcd',1,'operator<=(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23bf29cabff89d8549d818ef43147c14',1,'operator<=(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga296d4d026d70f8f76aab066328f3d3fa',1,'operator<=(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45ca16669f94b285db4334a262f80063',1,'operator<=(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga22e88dd408d2e5cff64faeab249681ba',1,'operator<=(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a750fb20efa2f5a06000ccf33cd759b',1,'operator<=(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ce34596d222bf804c1e9bf7e3d1243',1,'operator<=(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11bdd191156ebdab62005a519b325200',1,'operator<=(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga74b2b32ec5290e7e12efc0856bd5f743',1,'operator<=(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf04bc7968693077bc7d4f2823645b88e',1,'operator<=(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga008bc5070a5b0e4af5cf5191f5d6b9d6',1,'operator<=(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a9a3aa7951e9c0e8d8adfbda9a72209',1,'operator<=(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga818519c31a2652549a00cd4d7393d79e',1,'operator<=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab796146ad2e11416ac65fba37c0b8625',1,'operator<=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga07ebffec69ff52e0b06760664c1f6734',1,'operator<=(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadb89b24d295438f54277d245ece9366',1,'operator<=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fc00541a0243c34358a3bf00f4da05a',1,'operator<=(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga90197d0db673130bc8a100773411d4bd',1,'operator<=(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7e43a07a9aa0a10c8d37116f06bd9a',1,'operator<=(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc2939c217e196e51ecd1b2a3e06c153',1,'operator<=(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fe4a35b631b3aaa2e0e857bcbbd6bad',1,'operator<=(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae309099345eee12887e40f5b0b050f3e',1,'operator<=(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad102af955636969a42dbffc6dbb01b46',1,'operator<=(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc0e7fca81b7c89968d39d89dc649b7a',1,'operator<=(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga21fc2950b93de4f956fbaf0758feb6a1',1,'operator<=(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71d7b36c9336f6fc1a843e54c4df8f0e',1,'operator<=(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41851377c29b820cf0506e6a0e709782',1,'operator<=(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12057494f0e2df897df3fc9841779e4d',1,'operator<=(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10792a96e7eb2e17bb8163ef90a323b4',1,'operator<=(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b7fbfe98286073cd2a5660902a39f04',1,'operator<=(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a1bebcff32a1bf7d2575d05bfeb7890',1,'operator<=(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaff6fe97435e41e89de0bdef31594a96',1,'operator<=(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa56d3d64ea9d3eb351f5df4712c7d56f',1,'operator<=(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga468b559ecf6624521e1c1dd45ef6d2e6',1,'operator<=(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cc5c1c549707034c570459ffee3e806',1,'operator<=(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9643b2618b16b6ab86f270012d70212a',1,'operator<=(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga788e492c5f919e8367629179e2524611',1,'operator<=(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb572141a492105ee211ba7c12d0777',1,'operator<=(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5db9beb4e23e8a160a22aa678720a87',1,'operator<=(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bed66c4065e1f21bc76995bfa99752b',1,'operator<=(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e90fe2cf3b8c107bfe31aa0b2f94e3c',1,'operator<=(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga576e04d2f78108d39b4461fcf6aded03',1,'operator<=(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf0c263dc40917991d1a7039432d3d4f9',1,'operator<=(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad5edc4d4087d24b678e8daf4926370ea',1,'operator<=(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13f7090565e4f7e704870536ed987057',1,'operator<=(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7cd1eaa84e6d908ae0e907de12fdcde9',1,'operator<=(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga375fc5f28c2b1e5962243287a28e5b58',1,'operator<=(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53ab9131041d6fc4ae7360291aee9b26',1,'operator<=(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f106914932b4cab06413eb2632ef2cd',1,'operator<=(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga04227753f6db79fdbfb9715240961a97',1,'operator<=(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab12191665fdc650dbf8500db71892fd0',1,'operator<=(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1001c72e6391934b7daaf15c66ab0d7',1,'operator<=(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga75483e6deab8535ed86eb6dc65947e0f',1,'operator<=(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72810c269851aae026716559fa2af537',1,'operator<=(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad14aafc9b0e4ab5e8090d0ac9a679583',1,'operator<=(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23d29f809003619e6d82b5b7ea7de995',1,'operator<=(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd09b7cc4b4786532fda053066dcbafd',1,'operator<=(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31edb90c4322609ec771e66e4583739e',1,'operator<=(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33819e2576485dff43ab99ca0e19560e',1,'operator<=(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b66f84f7275665c91b9fed5aed59be5',1,'operator<=(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35728a641902e5d67a7531342d2d43a1',1,'operator<=(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga83e1e3238a8f002f82a398ca042d3db2',1,'operator<=(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac37b679d33d766b5ce00013e7c96fc4c',1,'operator<=(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56fd29329dd70b608a25f8f8b462562f',1,'operator<=(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92c40110cfc6a7a10651b46b15c7533e',1,'operator<=(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b2a3a801109a2a06e5da8675728fe58',1,'operator<=(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga250eb7cdcb64312f4e2641501dc9baee',1,'operator<=(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f0089cb1db00710fd7233770bc30b60',1,'operator<=(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef2bba33802f57daa91e22602079a3a7',1,'operator<=(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05c460da93b4a465dbb65ea6c98d08e0',1,'operator<=(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga247f899b55928b075fc919076f5e5949',1,'operator<=(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga914be25957de16f44b85396ba88a7f5d',1,'operator<=(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e5a6258674087258ec46bf94c668353',1,'operator<=(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2dbc819cf82263e9ec490552404734',1,'operator<=(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4eff31462c5876d989bad00f346ab183',1,'operator<=(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga03fe55d350f74009fef23cbf85c265c4',1,'operator<=(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad73033b2ed798b55ac0e978547e2dcdd',1,'operator<=(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08dfbf27c72c08bc5b257948694cc3e1',1,'operator<=(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7460f2ca99c07231e71c964b4b584ac',1,'operator<=(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b414d7742537f5def6a1f1dbbcee688',1,'operator<=(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga26a1f07e6149542f2488750c2af3c068',1,'operator<=(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc181ce10142dbd76ee1376a3cd90fdd',1,'operator<=(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40b2bb5b5a77fa89913fb57853cde453',1,'operator<=(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac06f6f101ec8cfcaf490ec6f041a837f',1,'operator<=(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8e0bfab992ab8a121c15af1e82829ac',1,'operator<=(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e24ea99fa24b52f3669e40c16c2a0f7',1,'operator<=(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad1e079957fbf820718af8a90067d68a9',1,'operator<=(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93b6391a06707b6be2ca59da57057086',1,'operator<=(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61706e65d948e11d869534a6653c00bf',1,'operator<=(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99abc45e21e9f42fd926a8e83cdab296',1,'operator<=(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba541b96bbc1af333e8a13eb1dc169d',1,'operator<=(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7a9638a0e70f17231a9e10fecedb0b2',1,'operator<=(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga455fe5a0dbcd6e20648e5bc2dd13fd6c',1,'operator<=(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2618b57557803d2ac6d3450904bf7e6',1,'operator<=(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81ad206b773be555181e771e60d3d80d',1,'operator<=(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2589f700026397ad0058d21462da1714',1,'operator<=(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac57dc63fcc9e6782a2af19c0a14bf769',1,'operator<=(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5f991c778ac1f18cd26ec9a6ae5ff72',1,'operator<=(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7a1cc2de07b5b85ef8a5b16d01e487b',1,'operator<=(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa452eeb5d53100bd938b7e1bb338d995',1,'operator<=(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga987b56ea0c72d063c0556dd6cac14929',1,'operator<=(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9292c118b4add3d2e427413547c585fb',1,'operator<=(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa546cd23c9536ca329dbc1c6cccb7497',1,'operator<=(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga93ec0c62ac154d66d9623f15fdac7c91',1,'operator<=(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5f767e3bf13cbd06503128dae485024',1,'operator<=(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga925e42dbf144296f0d9586569a04f490',1,'operator<=(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga616315867d4da80fdfe8216599b6537e',1,'operator<=(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92fbe24a4d7fc8e87ea5663cad49fcf1',1,'operator<=(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73c4504f2ad38a1eb98bcf0da9989196',1,'operator<=(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga525f070d7c6ab195d7c415794a412214',1,'operator<=(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadcb29143e8afd81a0c0f520bb43c16b6',1,'operator<=(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0cb74c8f5ee39656481d92ba33911254',1,'operator<=(double s, const double4 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a8002d09a2b548cf3abc2bd4aeafbce78',1,'__gnu_cxx::operator<=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a08ad6f0a285af9120e6d882594281672',1,'__gnu_cxx::operator<=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a3672b11b2bb1fc3a4b22f6d29473af87',1,'__gnu_cxx::operator<=(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a930dd0467ade4b159f585b09a918c395',1,'std::operator<=(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8d12abc1fb7e7cd1c53769a0fc5ff75f',1,'std::operator<=(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9e2bd7d69af9d03b7df4858595a3202e',1,'std::operator<=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#adb3e9ff06db8a5cc1105aaea9e01abd2',1,'std::operator<=(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5b152596ab130d1c97908b694e5fd761',1,'std::operator<=(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga6d0ebab63e2fcfb19ad69237091d4d7f',1,'std::operator<=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a54c920ed5017335b380d77d540169c76',1,'std::operator<=(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fd4bec06d2b472f7002ee98aea643af',1,'std::operator<=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gac012e10e6bb4ba58875ad515b9b9f05d',1,'std::operator<=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga490e9054301cbb70120a6b0202cee45d',1,'std::operator<=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5620ce8b20ede9f7494a66af23212304',1,'std::operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga84b53be86a6dfea454c23d5207d0864d',1,'std::operator<=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af19b07884ac9b3b0986b70d79bdc7ec1',1,'std::operator<=(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a407132a3a46dfa53d8f1e7810ee5b54d',1,'std::operator<=(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeb2fd054122ecce964976201c05a73cc',1,'std::operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acc2c10d2a7234cc66fd327a6f65954f7',1,'std::operator<=(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab0de944941fcbe6618dba4837b31deaa',1,'std::operator<=(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8921c2d57c14b7e9702a9500bde8aba9',1,'std::operator<=(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a25c829a4d9c4e577f0b11223bd00aced',1,'std::operator<=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac39a97945b49c71df0816226ff72807f',1,'std::operator<=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a72de11bf9e31d206cda3e333812a3f5a',1,'std::operator<=(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a00e5655f35d242d0995153643aea2ebc',1,'std::__debug::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a513766abdb4ed2ba58d8792147ebf811',1,'std::__profile::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#aaf5340c412fb69ca76ea39d768f04ce4',1,'std::rel_ops::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gae39d9fee6e2bb1642be73a0474be71b3',1,'std::tr2::operator<=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gae39d9fee6e2bb1642be73a0474be71b3',1,'operator<=(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga6d0ebab63e2fcfb19ad69237091d4d7f',1,'operator<=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fd4bec06d2b472f7002ee98aea643af',1,'operator<=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gac012e10e6bb4ba58875ad515b9b9f05d',1,'operator<=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga490e9054301cbb70120a6b0202cee45d',1,'operator<=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5620ce8b20ede9f7494a66af23212304',1,'operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga84b53be86a6dfea454c23d5207d0864d',1,'operator<=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaeb2fd054122ecce964976201c05a73cc',1,'operator<=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga9e2bd7d69af9d03b7df4858595a3202e',1,'operator<=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], + ['operator_3d_121',['operator=',['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a76321e46a6c9fd0cb68c1ecc862cb515',1,'cv::util::any::operator=(any &&)=default'],['https://docs.opencv.org/4.2.0/d9/dc4/classcv_1_1util_1_1any.html#a825b496ef0087775e11beb91d157d0c8',1,'cv::util::any::operator=(any const &src)'],['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a13709e8c99dac446a1c1ed71798eee72',1,'cv::AsyncArray::operator=()'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#aa39cabdf05e3b14aadee5dec3e7baa0e',1,'cv::AsyncPromise::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'cv::AutoBuffer::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'AutoBuffer< double, 1 >::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'AutoBuffer< int64, 1 >::operator=()'],['https://docs.opencv.org/4.2.0/d8/dd0/classcv_1_1AutoBuffer.html#ad8be3a945146d9528f747eafb6c34a81',1,'AutoBuffer< String, 1 >::operator=()'],['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#a52a7237f767b8d0269724c481329b6d5',1,'cv::detail::CameraParams::operator=()'],['https://docs.opencv.org/4.2.0/d0/d2e/classcv_1_1CommandLineParser.html#a1b7982e6ea32e8653ae0543ff0a81354',1,'cv::CommandLineParser::operator=()'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#a43a8ac6dd8cb0d342d39a65acf402217',1,'cv::ocl::Context::operator=()'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1gapi_1_1wip_1_1Data.html#a3ae38e8c51ce271fab188d7da2272fed',1,'cv::gapi::wip::Data::operator=(const T &t)'],['https://docs.opencv.org/4.2.0/d7/d84/structcv_1_1gapi_1_1wip_1_1Data.html#a5e490199d72c9f1c81663c3225c893d2',1,'cv::gapi::wip::Data::operator=(T &&t)'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a1b0465bff476900efb5ca2f238563997',1,'cv::ocl::Device::operator=()'],['https://docs.opencv.org/4.2.0/d4/db3/structcv_1_1dnn_1_1DictValue.html#acc5ccf38e7abf268d032074cff8d5cc2',1,'cv::dnn::DictValue::operator=()'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7b1a3493d50b1d4fb636aa1550cdce34',1,'cv::FileNode::operator=()'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#aeffb68f308d077062d0ced1a57ebd489',1,'cv::FileNodeIterator::operator=()'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#ad1432eed28a34f995a641a296281e01c',1,'cv::cuda::GpuMat::operator=()'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a3e2a15bc4185f48943ed354e1b927ad6',1,'cv::cudev::GpuMat_::operator=(const GpuMat_ &m)'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a6075adc7a8150ea7069235c7793b7c69',1,'cv::cudev::GpuMat_::operator=(const Expr< Body > &expr)'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#a086c7947f5c106c9b238ba9dcbcb2f1c',1,'cv::cuda::HostMem::operator=()'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#a1034c0afe903b367b0f47c1916d9616f',1,'cv::ocl::Image2D::operator=()'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#aa2694f462b29140fd21bc0e6f5380f0b',1,'cv::ocl::Kernel::operator=()'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aed1f81fe7efaacc2bd95149cdfa34302',1,'cv::Mat::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a2a0798475170fb3a23b5bc63686de334',1,'cv::Mat::operator=(const MatExpr &expr)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa5c947f7e449a4d856a4f3a87fcebd50',1,'cv::Mat::operator=(const Scalar &s)'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#a86d190d68dbd801a2bd555d0905979fd',1,'cv::Mat::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a125f510bec573808666906a95ea09cb4',1,'cv::gapi::own::Mat::operator=(Mat const &src)=default'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#aa9caec4b6b0cf0f7ae8bb7808154d594',1,'cv::gapi::own::Mat::operator=(Mat &&src)=default'],['https://docs.opencv.org/4.2.0/d1/d24/classcv_1_1gapi_1_1own_1_1Mat.html#a3709c060fa62e45132ab1932a73803c8',1,'cv::gapi::own::Mat::operator=(const Scalar &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'cv::Mat_::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'cv::Mat_::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'cv::Mat_::operator=(const _Tp &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'cv::Mat_::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'cv::Mat_::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'cv::Mat_::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< double >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< double >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< double >::operator=(const double &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< double >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< double >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< double >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< float >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< float >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< float >::operator=(const float &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< float >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< float >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< float >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< uchar >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< uchar >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< uchar >::operator=(const uchar &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< uchar >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< uchar >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< uchar >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#afa953e9a1c92c930aed2bf1af0f61502',1,'Mat_< unsigned char >::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#ac6f78b6d08dddf2857a0adecb12a43d0',1,'Mat_< unsigned char >::operator=(const Mat_ &m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a58f65e6db94e9c92d58ff3ae523ae340',1,'Mat_< unsigned char >::operator=(const unsigned char &s)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abef1723d8e964c9bd388b62c862b3a24',1,'Mat_< unsigned char >::operator=(const MatExpr &e)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#abf2d707a1cb8925542eaf165b6d551c2',1,'Mat_< unsigned char >::operator=(Mat_ &&m)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a3d95a481bbb23243f8dea8a569cf8d97',1,'Mat_< unsigned char >::operator=(Mat &&m)'],['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#ae5b2d39c2deb60c6db6202034e28182d',1,'cv::detail::MatchesInfo::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#af1c80909af2a28c1b98c6bf1f53984d7',1,'cv::MatConstIterator::operator=()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#af7430e2fa55817bdd66753a5af7f3242',1,'cv::MatConstIterator_::operator=()'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#af31e606676d1cd6bdeedcbdd1ea4fb41',1,'cv::gapi::own::detail::MatHeader::operator=(const MatHeader &)=default'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#ac6efb1a462a75da9fad1c38cbbc99bac',1,'cv::gapi::own::detail::MatHeader::operator=(MatHeader &&src)'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#a531046b556e382f91c55e3076083f051',1,'cv::MatIterator_::operator=()'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a325af086a8a2a9be290ca92d3b4946c5',1,'cv::MatStep::operator=(size_t s)'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a9927dacc19715875bf7518207445e0ad',1,'cv::MatStep::operator=(const MatStep &)'],['https://docs.opencv.org/4.2.0/d7/dc2/classcv_1_1instr_1_1NodeData.html#af66d2f09b331f5de963a2cfa0d7ba21e',1,'cv::instr::NodeData::operator=()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a2e6daae54312f1bbe7a832e8083a7af9',1,'cv::util::optional::operator=(const optional &rhs)=default'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a11564f1271c6c1aa95c98ba7385c6779',1,'cv::util::optional::operator=(optional &&rhs)'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#ad7a69d27e55090b7019236b251d57a81',1,'cv::ocl::Platform::operator=()'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#ad25bce73d8db1173fd08fe631e2a2389',1,'cv::ocl::PlatformInfo::operator=()'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a892446cde2db30f149f572b92619dc9f',1,'cv::Point3_::operator=(const Point3_ &pt)'],['https://docs.opencv.org/4.2.0/df/d6c/classcv_1_1Point3__.html#a272296b0541449dbe926deb557f18fa7',1,'cv::Point3_::operator=(Point3_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'cv::Point_::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'cv::Point_::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'Point_< double >::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'Point_< double >::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'Point_< float >::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'Point_< float >::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#abf33cd1b15c729e84a3f6351b8a8f814',1,'Point_< int >::operator=(const Point_ &pt)'],['https://docs.opencv.org/4.2.0/db/d4e/classcv_1_1Point__.html#af7eabb6f8ae98e26836a72983d309f06',1,'Point_< int >::operator=(Point_ &&pt) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#a9d76780ecc8d97fe76ef926123c507c0',1,'cv::ocl::Program::operator=()'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#ac472f17bd1ee3bab677b38e773d82638',1,'cv::ocl::ProgramSource::operator=()'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#acaf2d9afbd65c6ade583f73a2c5023e5',1,'cv::ocl::Queue::operator=()'],['https://docs.opencv.org/4.2.0/d3/d22/classcv_1_1gapi_1_1own_1_1Rect.html#aca0529ecae368b5027176331f4257bd4',1,'cv::gapi::own::Rect::operator=()'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#ab9b239b3562b94f07e46551d05af97c6',1,'cv::Rect_::operator=(const Rect_ &r)'],['https://docs.opencv.org/4.2.0/d2/d44/classcv_1_1Rect__.html#a8228f59c183fca9695ae329dc773a3e1',1,'cv::Rect_::operator=(Rect_ &&r) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ad95d917b9fb9a0053929b2b5c84bb5b2',1,'cv::Scalar_::operator=(const Scalar_ &s)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a8ea9d461de3c6e04f64c2f2ee1751cd2',1,'cv::Scalar_::operator=(Scalar_ &&s) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#ad95d917b9fb9a0053929b2b5c84bb5b2',1,'Scalar_< double >::operator=(const Scalar_ &s)'],['https://docs.opencv.org/4.2.0/d1/da0/classcv_1_1Scalar__.html#a8ea9d461de3c6e04f64c2f2ee1751cd2',1,'Scalar_< double >::operator=(Scalar_ &&s) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d7/d3e/classcv_1_1gapi_1_1own_1_1Size.html#aa126ea44724ae43d1fc1597397d9b3f5',1,'cv::gapi::own::Size::operator=()'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a7a115285576d3211b24bda4628ee7f4d',1,'cv::Size_::operator=(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#aa7a87199e67360f44636ec30b1183fcd',1,'cv::Size_::operator=(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#a7a115285576d3211b24bda4628ee7f4d',1,'Size_< float >::operator=(const Size_ &sz)'],['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1Size__.html#aa7a87199e67360f44636ec30b1183fcd',1,'Size_< float >::operator=(Size_ &&sz) CV_NOEXCEPT'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf80704eb7bfc3257da30ad5a82fb9de',1,'cv::softdouble::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9451cdb3a66bebcc1f5e8b409f780b7f',1,'cv::softfloat::operator=()'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a144c0f1ec1d3ffc20305bc4d1747b741',1,'cv::SparseMat::operator=(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#a9e634f2d73a077444df4395e50821129',1,'cv::SparseMat::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#aa9ea60ee22d3ba75ccb16365eda3f096',1,'cv::SparseMat_::operator=(const SparseMat &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#a3a90de6441880eae3ba875a0fed2700e',1,'cv::SparseMat_::operator=(const SparseMat_ &m)'],['https://docs.opencv.org/4.2.0/d7/d8a/classcv_1_1SparseMat__.html#aebaca1182543e7e71ee5c4f73a088c90',1,'cv::SparseMat_::operator=(const Mat &m)'],['https://docs.opencv.org/4.2.0/df/dec/classcv_1_1SparseMatConstIterator.html#a9ad2aca73fd447e5642b1c21bd978cd3',1,'cv::SparseMatConstIterator::operator=()'],['https://docs.opencv.org/4.2.0/d9/d29/classcv_1_1SparseMatConstIterator__.html#afe543867ec13099311670ad837eab611',1,'cv::SparseMatConstIterator_::operator=()'],['https://docs.opencv.org/4.2.0/d5/d9b/classcv_1_1SparseMatIterator.html#a69fe44b15c6618424367d24b8b99b9e4',1,'cv::SparseMatIterator::operator=()'],['https://docs.opencv.org/4.2.0/d3/d24/classcv_1_1SparseMatIterator__.html#ad1d385d5c83a9c1104e9a197e331881c',1,'cv::SparseMatIterator_::operator=()'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#aac5e0ed13076c2371fa41d215a49b17f',1,'cv::UMat::operator=(const UMat &m)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a245c83dba9f05fc44d44d557f86101f1',1,'cv::UMat::operator=(const Scalar &s)'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a561c1a335882bfe799e4235ee8fb67a6',1,'cv::UMat::operator=(UMat &&m)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a06701f71c52af321d833f6f3fdcfb89f',1,'cv::util::variant::operator=(const variant &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#abcd060a1b68f44893b2f15547f46b1d1',1,'cv::util::variant::operator=(variant &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a5d690841b784f348c9db1e741de8be0e',1,'cv::util::variant::operator=(T &&t) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a37e79528fb523179954532c12afb3e5b',1,'cv::util::variant::operator=(const variant< Ts... > &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a0f2388dd0dd28e24b5842cd1b432008c',1,'cv::util::variant::operator=(variant< Ts... > &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a06701f71c52af321d833f6f3fdcfb89f',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(const variant &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#abcd060a1b68f44893b2f15547f46b1d1',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(variant &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a5d690841b784f348c9db1e741de8be0e',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(T &&t) noexcept'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a37e79528fb523179954532c12afb3e5b',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(const variant< Ts... > &rhs)'],['https://docs.opencv.org/4.2.0/dc/d3e/classcv_1_1util_1_1variant.html#a0f2388dd0dd28e24b5842cd1b432008c',1,'variant< cv::util::monostate, ro_ext_t, rw_ext_t, rw_own_t >::operator=(variant< Ts... > &&rhs) noexcept'],['https://docs.opencv.org/4.2.0/d6/d32/classcv_1_1viz_1_1Viz3d.html#afced2add96752159cd3a20f7592a528f',1,'cv::viz::Viz3d::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcd/classcv_1_1viz_1_1Widget.html#a32e9fb3b4821e9aa0163c54fdcb8ce3c',1,'cv::viz::Widget::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a7bee901f7465419633250caa04983ef6',1,'__gnu_cxx::__versa_string::operator=(const __versa_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a46713802e19d9139db7468030060ebaf',1,'__gnu_cxx::__versa_string::operator=(__versa_string &&__str) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aa833376e55c1b6c75179e976043e6dd6',1,'__gnu_cxx::__versa_string::operator=(std::initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a01f0f4f2476992da89a882cb4f35c52e',1,'__gnu_cxx::__versa_string::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#aa1d106b3b5ff8313d6d646f9aec5adc6',1,'__gnu_cxx::__versa_string::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#ae0afa6ce3f2e1d626b46ad157edb0a39',1,'__gnu_debug::_Safe_iterator::operator=(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a8289e4e52eca797212f8ed2f7ac06484',1,'__gnu_debug::_Safe_iterator::operator=(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#aa7d1bbc86a00f5af9a96cc55c7914cce',1,'__gnu_debug::_Safe_local_iterator::operator=(const _Safe_local_iterator &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08647.html#a63641a3d3e09e8c2ef28e47d9f4b6057',1,'__gnu_debug::_Safe_local_iterator::operator=(_Safe_local_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#ae0afa6ce3f2e1d626b46ad157edb0a39',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator=(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a8289e4e52eca797212f8ed2f7ac06484',1,'_Safe_iterator< _Iterator, _Sequence, std::bidirectional_iterator_tag >::operator=(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#ae0afa6ce3f2e1d626b46ad157edb0a39',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator=(const _Safe_iterator &__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08643.html#a8289e4e52eca797212f8ed2f7ac06484',1,'_Safe_iterator< _Iterator, _Sequence, std::forward_iterator_tag >::operator=(_Safe_iterator &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< _CharT >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< _CharT >::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< _CharT >::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< _CharT >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< _CharT >::operator=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< _CharT, _Traits, _Allocator >::operator=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(const _Elem *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(_Elem __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator=(initializer_list< _Elem > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< char >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< char >::operator=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< char >::operator=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< char >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< char >::operator=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(const char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(char __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator=(initializer_list< char > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< char_type, _Traits, _Alloc >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< char_type, _Traits, _Alloc >::operator=(const char_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< char_type, _Traits, _Alloc >::operator=(char_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< char_type, _Traits, _Alloc >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< char_type, _Traits, _Alloc >::operator=(initializer_list< char_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'basic_string< value_type >::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'basic_string< value_type >::operator=(const value_type *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'basic_string< value_type >::operator=(value_type __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'basic_string< value_type >::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'basic_string< value_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#acbbd2ced11be9e416c030bf3dcaeacad',1,'deque< _StateSeqT >::operator=(const deque &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a77734a257fa1c71752517d0ae6ae707d',1,'deque< _StateSeqT >::operator=(deque &&__x) noexcept(_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a74898d8b495f47ced979e6ba66c4eef1',1,'deque< _StateSeqT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a35a994d029c0e0cf92abf1f468cfa140',1,'list< __inp, __rebind_inp >::operator=(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8f9b65b72c23e8c124c5f4a6e11013e0',1,'list< __inp, __rebind_inp >::operator=(list &&__x) noexcept(_Node_alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b554a6eab6e57e565eedb7da72a83c5',1,'list< __inp, __rebind_inp >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aaa530908380c41e867d3d3d8d6dcf017',1,'match_results< _Bi_iter >::operator=(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a9066bb40864217bcf43710d9ea95bd86',1,'match_results< _Bi_iter >::operator=(match_results &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04755.html#af6ed2d0a405aee06f81dda8452a6e2ce',1,'std::__allocated_ptr::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#af798a3136d8030f2158837fde7373f5b',1,'std::auto_ptr::operator=(auto_ptr &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08511.html#adf78f102f371538dbe78a57976053736',1,'std::auto_ptr::operator=(auto_ptr< _Tp1 > &__a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07659.html#aa94f823e79ee65ed66fe128448d434ef',1,'std::back_insert_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a232af3b8f7c72e6c67ba9f3b6d1b256d',1,'std::basic_regex::operator=(const basic_regex &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a8d6c69a28d8c523cae6f7322095490d5',1,'std::basic_regex::operator=(basic_regex &&__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#aaf3c150b855c8dddc84f7a33519dba7f',1,'std::basic_regex::operator=(const _Ch_type *__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#ae9f733548bcdaf906573129bed9c10fa',1,'std::basic_regex::operator=(initializer_list< _Ch_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06747.html#a85898504e41caa15dfed44321f36c4c9',1,'std::basic_regex::operator=(const basic_string< _Ch_type, _Ch_traits, _Alloc > &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aa8f6f22768d186c590681e47f84c121b',1,'std::basic_string::operator=(const basic_string &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a35293bfc788d5cfbd78bca7bb3f7e43a',1,'std::basic_string::operator=(const _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a79cf5ca6fa3860d67ddde51fc19f4a2d',1,'std::basic_string::operator=(_CharT __c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aaf111030848945ff5ea674b5f22552ed',1,'std::basic_string::operator=(basic_string &&__str) noexcept(/*conditional */)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#a12d94f9bbcb2ed1ae495aafaae17b39d',1,'std::basic_string::operator=(initializer_list< _CharT > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga92ff752125c60794c33d55db59b48105',1,'std::complex::operator=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaebc147a1a3a6e326215cd323aafa6bc6',1,'std::complex::operator=(const complex< _Up > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#acbbd2ced11be9e416c030bf3dcaeacad',1,'std::deque::operator=(const deque &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a77734a257fa1c71752517d0ae6ae707d',1,'std::deque::operator=(deque &&__x) noexcept(_Alloc_traits::_S_always_equal())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a74898d8b495f47ced979e6ba66c4eef1',1,'std::deque::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a146ce22d8e7f66b46766d6de66fb6584',1,'std::experimental::fundamentals_v1::any::operator=(const any &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#a0453d90a8d4fb2325712c4e5f3b909a7',1,'std::experimental::fundamentals_v1::any::operator=(any &&__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09963.html#af377e421f8e38d5873afb4d84aab606b',1,'std::experimental::fundamentals_v1::any::operator=(_ValueType &&__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a78c1273fb53228cab655addd77f9cd25',1,'std::forward_list::operator=(const forward_list &__list)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#aaedecd0634ab8c057cca203778ea6cfa',1,'std::forward_list::operator=(forward_list &&__list) noexcept(_Node_alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05519.html#a6b8dfcf0c3aad308699e909186c39f2b',1,'std::forward_list::operator=(std::initializer_list< _Tp > __il)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07663.html#ad88a7eabbaf51cfa7c8152e1c27d226f',1,'std::front_insert_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a698ecd83665a25c0c1f9cbe2ea85c2a0',1,'std::function< _Res(_ArgTypes...)>::operator=(const function &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a00bb39127d1936767cbfd81c4bb02354',1,'std::function< _Res(_ArgTypes...)>::operator=(function &&__x) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#a05ea81faa27f6b5511b699634b83c4a8',1,'std::function< _Res(_ArgTypes...)>::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#afbb6bdd269617d2793d4dbbb078f6707',1,'std::function< _Res(_ArgTypes...)>::operator=(_Functor &&__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07175.html#afc4ca535d5508c13e9112b39c8c064d4',1,'std::function< _Res(_ArgTypes...)>::operator=(reference_wrapper< _Functor > __f) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga59fd646ebf243e99b2063baf37ba91d0',1,'std::gslice::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf25507c9a66f729500964d397b7cb9fb',1,'std::gslice_array::operator=(const gslice_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf2a0c3883cfb758e05e3d62ec7e0a07f',1,'std::gslice_array::operator=(const valarray< _Tp > &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8dfed8c043d7a82e4b71cf65c64ec844',1,'std::gslice_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga73cce032d98e922eeafb676920174f52',1,'std::indirect_array::operator=(const indirect_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga6072ae14d756314665aef25c55cc4d33',1,'std::indirect_array::operator=(const valarray< _Tp > &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac17dafc8657c7fd6eab36a46260ff97f',1,'std::indirect_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07667.html#a97b27e02a31008441dd0374c6a1021e4',1,'std::insert_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a35a994d029c0e0cf92abf1f468cfa140',1,'std::list::operator=(const list &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a8f9b65b72c23e8c124c5f4a6e11013e0',1,'std::list::operator=(list &&__x) noexcept(_Node_alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07755.html#a7b554a6eab6e57e565eedb7da72a83c5',1,'std::list::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a21b4d6ac8a3c4614656b67eec61b5f9d',1,'std::locale::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a0ffbbf85c084d61ab49c7fec028bafba',1,'std::map::operator=(const map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a28b4c4feee2bbdf398540f4097d4bb91',1,'std::map::operator=(map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#ac01f44f3ed4b9dbebcb046b4103f920c',1,'std::map::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac8928f66422bd3601fcf43b79761abd5',1,'std::mask_array::operator=(const mask_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2af95af73e734b394322ec304e1b73f2',1,'std::mask_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#aaa530908380c41e867d3d3d8d6dcf017',1,'std::match_results::operator=(const match_results &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a9066bb40864217bcf43710d9ea95bd86',1,'std::match_results::operator=(match_results &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#acd76a5f8a95e15654c8e61c55f1fdc61',1,'std::multimap::operator=(const multimap &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#aebc9eaf75029cfb33e4121a75a875713',1,'std::multimap::operator=(multimap &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07759.html#a069fcb3baa5b568196b04950e380b865',1,'std::multimap::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a20d46cd310dd519085bca08a77ca0116',1,'std::multiset::operator=(const multiset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a572d0693c78910dc45ba3a5374066f7d',1,'std::multiset::operator=(multiset &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07779.html#a92ec8ff818ef21f8d170842d4732299c',1,'std::multiset::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02635.html#adbefc6681906783e9e20249895a98082',1,'std::once_flag::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a3c5547f8d577192a0c4672ef08a1b166',1,'std::ostream_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#abcdedbb3c0f65a77d78cd15466ec7c73',1,'std::ostreambuf_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#a86764099987b135d0966eda405b99de8',1,'std::regex_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a7701c80539dd9bb567d519151fe0484f',1,'std::regex_token_iterator::operator=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a8ffd6bc39d7e301ec0f77568e4c531c2',1,'std::set::operator=(const set &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#afc8c71ffd02970fa13cd6f6fbd40682b',1,'std::set::operator=(set &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07775.html#a8e269a4d9e589df1ef1bc6df659e7a96',1,'std::set::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga638dcc09b7202f5e671c6637bf01db31',1,'std::slice_array::operator=(const slice_array &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab5edb43da924e3c138ba22d29dc4c050',1,'std::slice_array::operator=(const valarray< _Tp > &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga3ddb6f583d7c7ef17b471662a4a7a7ac',1,'std::slice_array::operator=(const _Tp &) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a0aa055c3e0b3e447ea378c5982952d20',1,'std::tr2::dynamic_bitset::operator=(const dynamic_bitset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a617447d4740d9204992d8119a838aff7',1,'std::tr2::dynamic_bitset::operator=(dynamic_bitset &&__b) noexcept(std::is_nothrow_move_assignable< _Base >::value)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'std::unique_ptr::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'std::unique_ptr::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'std::unique_ptr::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a6591772e73b9c09f47f348484995e811',1,'std::unique_ptr< _Tp[], _Dp >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#ac4e60274f821a367b846aaf799897792',1,'std::unique_ptr< _Tp[], _Dp >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#ac873de4914a9d9182497101f8c66ac10',1,'std::unique_ptr< _Tp[], _Dp >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aca0525353d274a1abca19e123ca58702',1,'std::unordered_map::operator=(const unordered_map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d63494d15ed6c47df072d06d9608ca0',1,'std::unordered_map::operator=(unordered_map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a46087d4d85698c13e7fe5e10f13821d1',1,'std::unordered_map::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a04b3ff006b08f143403c12e743ced9b6',1,'std::unordered_multimap::operator=(const unordered_multimap &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#ac9f4a7b990b045b2709562eb6b7f9328',1,'std::unordered_multimap::operator=(unordered_multimap &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08043.html#a1dd84e27aa97a782f79e757eadcd5461',1,'std::unordered_multimap::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#a9e17536caf4f009c1a337cbdc65b10e4',1,'std::unordered_multiset::operator=(const unordered_multiset &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#abc404eb73cb8ffa4efb906fd400e476b',1,'std::unordered_multiset::operator=(unordered_multiset &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08051.html#adfc21fb29e21a666c726325bdbab7fd8',1,'std::unordered_multiset::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a28b4eb4e12733c87d05ecd05c23e4269',1,'std::unordered_set::operator=(const unordered_set &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#ae40948838a04772d6e2e0281ccbde1f3',1,'std::unordered_set::operator=(unordered_set &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08055.html#a3c34d8e0d4bfc8c91c4b54b5199edc04',1,'std::unordered_set::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafd9682220fbb71cdd3780fb0b80a7840',1,'std::valarray::operator=(const valarray< _Tp > &__v)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0b40ea6b05b21b6506d3541205bbfe64',1,'std::valarray::operator=(valarray< _Tp > &&__v) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga80a24d05a21101fb1e8f32d7617b349a',1,'std::valarray::operator=(const _Tp &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga708c338c38f644c83fb4440add0a7f82',1,'std::valarray::operator=(const slice_array< _Tp > &__sa)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga975285295867516982cbd04e5416ca33',1,'std::valarray::operator=(const gslice_array< _Tp > &__ga)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga008f37655c6e6e55b37c9b46efd259c1',1,'std::valarray::operator=(const mask_array< _Tp > &__ma)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad58ef4619934cdeccb9b476c6e8ccceb',1,'std::valarray::operator=(const indirect_array< _Tp > &__ia)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga781c3cfba5752871b9b8df2717f3d301',1,'std::valarray::operator=(initializer_list< _Tp > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'std::vector::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'std::vector::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'std::vector::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Codecvt >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Codecvt >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Codecvt >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Res_type >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Res_type >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Res_type >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Result< _Res > >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Result< _Res > >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Result< _Res > >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< _Result_base >::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< _Result_base >::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< _Result_base >::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a0d690f8c5fd6b05f0ceb1dc04d79c821',1,'unique_ptr< bool[]>::operator=(unique_ptr &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#ada7596fc9242151849616db656f4224e',1,'unique_ptr< bool[]>::operator=(unique_ptr< _Up, _Ep > &&__u) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08015.html#a53f23836b9dcfc3558e768d48969a903',1,'unique_ptr< bool[]>::operator=(nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#aca0525353d274a1abca19e123ca58702',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator=(const unordered_map &)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a7d63494d15ed6c47df072d06d9608ca0',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator=(unordered_map &&)=default'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a46087d4d85698c13e7fe5e10f13821d1',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafd9682220fbb71cdd3780fb0b80a7840',1,'valarray< size_t >::operator=(const valarray< size_t > &__v)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0b40ea6b05b21b6506d3541205bbfe64',1,'valarray< size_t >::operator=(valarray< size_t > &&__v) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga80a24d05a21101fb1e8f32d7617b349a',1,'valarray< size_t >::operator=(const size_t &__t)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga708c338c38f644c83fb4440add0a7f82',1,'valarray< size_t >::operator=(const slice_array< size_t > &__sa)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga975285295867516982cbd04e5416ca33',1,'valarray< size_t >::operator=(const gslice_array< size_t > &__ga)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga008f37655c6e6e55b37c9b46efd259c1',1,'valarray< size_t >::operator=(const mask_array< size_t > &__ma)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad58ef4619934cdeccb9b476c6e8ccceb',1,'valarray< size_t >::operator=(const indirect_array< size_t > &__ia)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga781c3cfba5752871b9b8df2717f3d301',1,'valarray< size_t >::operator=(initializer_list< size_t > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< __diff_type >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< __diff_type >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< __diff_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _CharClassT >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _CharClassT >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _CharClassT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _CharT >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _CharT >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _CharT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _Cmpt >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _Cmpt >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _Cmpt >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _Node *, _Nodeptr_Alloc >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _Node *, _Nodeptr_Alloc >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _Node *, _Nodeptr_Alloc >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _RealType >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _RealType >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _RealType >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _State< _TraitsT::char_type > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _State< _TraitsT::char_type > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _State< _TraitsT::char_type > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< _StringT >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< _StringT >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< _StringT >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< block_type, allocator_type >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< block_type, allocator_type >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< block_type, allocator_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< Catalog_info * >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< Catalog_info * >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< Catalog_info * >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< double >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< double >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< double >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< int >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< int >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< int >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< result_type >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< result_type >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< result_type >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< size_t >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< size_t >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< size_t >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< std::pair< _BiIter, int > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< std::pair< _BiIter, int > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< std::pair< _BiIter, int > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< std::pair< _StateIdT, std::vector > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< std::pair< _StateIdT, std::vector > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< std::pair< _StateIdT, std::vector > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator=(initializer_list< value_type > __l)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a9c56711f1fdb6aeb4a287570da90a688',1,'vector< sub_match< _BiIter >, _Alloc >::operator=(const vector &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a3bcd2b28b84df51df419171868014a84',1,'vector< sub_match< _BiIter >, _Alloc >::operator=(vector &&__x) noexcept(_Alloc_traits::_S_nothrow_move())'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a5badc45ac5ba40fafcbb6ec5a0b8a745',1,'vector< sub_match< _BiIter >, _Alloc >::operator=(initializer_list< value_type > __l)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#a61747e22cfd8bd36456de2deed877fca',1,'Eigen::AngleAxis::operator=(const MatrixBase< Derived > &mat)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1AngleAxis.html#aa79ba9655d1b8fe12d75082902cea88b',1,'Eigen::AngleAxis::operator=(const QuaternionBase< QuatDerived > &q)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Eigen::Array::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Eigen::Array::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Eigen::Array::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Eigen::Array::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< double, DPARM_SIZE, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< double, DPARM_SIZE, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< double, DPARM_SIZE, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< double, DPARM_SIZE, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< double, UMFPACK_CONTROL, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< double, UMFPACK_INFO, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< Index, 1, Dynamic >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< Index, 1, Dynamic >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< Index, 1, Dynamic >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< Index, 1, Dynamic >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< int, IPARM_SIZE, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< int, IPARM_SIZE, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< int, IPARM_SIZE, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< int, IPARM_SIZE, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< RealScalar, Dynamic, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< RealScalar, Dynamic, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< RealScalar, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< RealScalar, Dynamic, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< StorageIndex, 2, 1 >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< StorageIndex, 2, 1 >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< StorageIndex, 2, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< StorageIndex, 2, 1 >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a86cb29d966d548242de713c59e9c9582',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const Array &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a4bda8f55edb3cb293c6ef3078362455b',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#a7f91aee7fcdc00e617525189144e94cd',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Array.html#ac32b3b262f92f135766a1b5cf4522b75',1,'Array< StorageIndex, 64, 1, DontAlign >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a8587d8d893f5225a4511e9d76d9fe3cc',1,'Eigen::ArrayBase::operator=(const ArrayBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a80cacb05b6881fba659efb2377e4fd22',1,'Eigen::ArrayBase::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a8587d8d893f5225a4511e9d76d9fe3cc',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator=(const ArrayBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArrayBase.html#a80cacb05b6881fba659efb2377e4fd22',1,'ArrayBase< ArrayWrapper< ExpressionType > >::operator=(const Scalar &value)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'Eigen::DenseBase::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'Eigen::DenseBase::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'Eigen::DenseBase::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'DenseBase< ArrayWrapper< ExpressionType > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a5281dadff89f46eef719b38e5d073a8f',1,'DenseBase< Solve< Decomposition, RhsType > >::operator=(const DenseBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#ab66155169d20c035e80d521a8b918e97',1,'DenseBase< Solve< Decomposition, RhsType > >::operator=(const DenseBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a58915510693d64164e567bd762e1032f',1,'DenseBase< Solve< Decomposition, RhsType > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DiagonalMatrix.html#a5d362adc0550baabcff2095c92c5045d',1,'Eigen::DiagonalMatrix::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Eigen::Matrix::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Eigen::Matrix::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Eigen::Matrix::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &(~RowMajor), MaxColsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< ComplexScalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< ComplexScalar, RowsAtCompileTime, ColsAtCompileTime, Options, MaxRowsAtCompileTime, MaxColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< int, 1, MatrixType::ColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< int, MatrixType::RowsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< RealScalar, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< RealScalar, Dynamic, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< RealScalar, Dynamic, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< RealScalar, Dynamic, Dynamic, ColMajor >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, 1, Size, Options|RowMajor, 1, MaxSize >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, 3, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, 3, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, 3, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, AmbientDimAtCompileTime, 1, Options >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, ColsAtCompileTime, 1, Options &~RowMajor, MaxColsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, ColsAtCompileTime, ColsAtCompileTime, MatrixOptions, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, DiagSizeAtCompileTime, DiagSizeAtCompileTime, MatrixOptions, MaxDiagSizeAtCompileTime, MaxDiagSizeAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Dim, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Dim, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Dim, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Dynamic, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Dynamic, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Index(AmbientDimAtCompileTime)==Dynamic ? Dynamic :Index(AmbientDimAtCompileTime)+1, 1, Options >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, RowsAtCompileTime, 1, 0, MaxRowsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, RowsAtCompileTime, RowsAtCompileTime, MatrixOptions, MaxRowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, Size, Size, ColMajor, MaxColsAtCompileTime, MaxColsAtCompileTime >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< Scalar, SizeMinusOne, 1, Options &~RowMajor, MaxSizeMinusOne, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< StorageIndex, 1, EIGEN_SIZE_MIN_PREFER_DYNAMIC(ColsAtCompileTime, RowsAtCompileTime), RowMajor, 1, EIGEN_SIZE_MIN_PREFER_FIXED(MaxColsAtCompileTime, MaxRowsAtCompileTime)>::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< StorageIndex, Dynamic, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< StorageIndex, Dynamic, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< StorageIndex, Dynamic, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a2477f75c24da9f1a1522a632b5934dd8',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a0b287f226563b8410312bd474b2a1ccc',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::operator=(const Matrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Matrix.html#a3fe9da2ac8949d30da03ac35801d34dd',1,'Matrix< StorageIndex, MatrixType::RowsAtCompileTime, 1 >::operator=(const RotationBase< OtherDerived, ColsAtCompileTime > &r)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a373bf62ad398162df5a71963ed7cbeff',1,'Eigen::MatrixBase::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a373bf62ad398162df5a71963ed7cbeff',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a373bf62ad398162df5a71963ed7cbeff',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'Eigen::PermutationBase::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'Eigen::PermutationBase::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< Map< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex >, _PacketAccess > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, _StorageIndex > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< PermutationMatrix< SizeAtCompileTime, MaxSizeAtCompileTime, StorageIndex > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#a8e15540549c5a4e2d5b3b426fef8fbcf',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator=(const PermutationBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationBase.html#acaa7cce9ea62c811cec12e86dbb2f0de',1,'PermutationBase< PermutationWrapper< _IndicesType > >::operator=(const TranspositionsBase< OtherDerived > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'Eigen::PermutationMatrix::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'Eigen::PermutationMatrix::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'PermutationMatrix< ColsAtCompileTime, MaxColsAtCompileTime >::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'PermutationMatrix< Dynamic, Dynamic, StorageIndex >::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#aeced50f1c3a43b3e4b3de76d57e9c46a',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const PermutationBase< Other > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PermutationMatrix.html#a75cdc77886972636637f22c41216feb9',1,'PermutationMatrix< RowsAtCompileTime, MaxRowsAtCompileTime >::operator=(const TranspositionsBase< Other > &tr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'Eigen::PlainObjectBase::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'Eigen::PlainObjectBase::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< double, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< Index, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Array< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< ComplexScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< int, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< RealScalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#ad90648194e9fa6a0e1296ba1e4db8787',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1PlainObjectBase.html#afbf3af8d6195c9b1b2103c2dd1231247',1,'PlainObjectBase< Matrix< StorageIndex, _Rows, _Cols, _Options, _MaxRows, _MaxCols > >::operator=(const PlainObjectBase &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'Eigen::QuaternionBase::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'Eigen::QuaternionBase::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#aa7c114c6e62a37d4fc53b6e82ed78eac',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator=(const AngleAxisType &aa)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#a20a6702c9da3fc2950178d920d0aaf84',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator=(const MatrixBase< MatrixDerived > &xpr)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Rotation2D.html#a9d3da523c37f4ef0574f35fd7b3b9662',1,'Eigen::Rotation2D::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1symbolic_1_1SymbolExpr.html#a0bd43167911dc398fba4e3f0f142a64d',1,'Eigen::symbolic::SymbolExpr::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a826047489741a19b81c6552f8257b1cf',1,'Eigen::Transform::operator=(const EigenBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a8ed8318285ccc7498197da7df1273bd5',1,'Eigen::Transform::operator=(const QMatrix &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transform.html#a54986164dcb1d0f7bfa216b8ef5272f6',1,'Eigen::Transform::operator=(const QTransform &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a991cbd0dcd647b414bbfdbacb642dbbd',1,'Eigen::Transpositions::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Transpositions.html#a991cbd0dcd647b414bbfdbacb642dbbd',1,'Transpositions< RowsAtCompileTime, MaxRowsAtCompileTime >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a09db8ccbd4b2da7c7e8d520458166cc1',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator=(const MatrixBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#a556c7e90c64e86a3a8e722989dda1bc6',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::operator=(const TriangularBase< OtherDerived > &other)'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'Eigen::VectorwiseOp::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const ArrayWrapper< ExpressionType >, Vertical >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Derived, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Derived, Vertical >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Homogeneous< MatrixType, _Direction >, Vertical >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Horizontal >::operator=()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1VectorwiseOp.html#a7999eb8f50bb19ade54f3212d3c79680',1,'VectorwiseOp< const Solve< Decomposition, RhsType >, Vertical >::operator=()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a1ae937c299f347a9dcb7f31a8e57762b.html#a1ae937c299f347a9dcb7f31a8e57762b',1,'nlohmann::basic_json::operator=()'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_a1a90dae111cf189ac9ad340a60b199b6.html#a1a90dae111cf189ac9ad340a60b199b6',1,'nlohmann::json_sax::operator=(const json_sax &)=default'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1json__sax_ac74584e3dc41f2465e69b37d7d2bf694.html#ac74584e3dc41f2465e69b37d7d2bf694',1,'nlohmann::json_sax::operator=(json_sax &&) noexcept=default'],['../classcam_1_1CameraParams.html#a7a73a289f11757797b23d816e2561dae',1,'cam::CameraParams::operator=()'],['../classrobot_1_1base__motor.html#a354ebc41c91a7f98c7b3b8cf8bfd145f',1,'robot::base_motor::operator=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9451cdb3a66bebcc1f5e8b409f780b7f',1,'operator=(const softfloat &c)(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gadf80704eb7bfc3257da30ad5a82fb9de',1,'operator=(const softdouble &c)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga92ff752125c60794c33d55db59b48105',1,'operator=(const _Tp &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaebc147a1a3a6e326215cd323aafa6bc6',1,'operator=(const complex< _Up > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf25507c9a66f729500964d397b7cb9fb',1,'operator=(const gslice_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga73cce032d98e922eeafb676920174f52',1,'operator=(const indirect_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gac8928f66422bd3601fcf43b79761abd5',1,'operator=(const mask_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf2a0c3883cfb758e05e3d62ec7e0a07f',1,'operator=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga59fd646ebf243e99b2063baf37ba91d0',1,'operator=(const gslice &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8dfed8c043d7a82e4b71cf65c64ec844',1,'operator=(const _Tp &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga638dcc09b7202f5e671c6637bf01db31',1,'operator=(const slice_array &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0b40ea6b05b21b6506d3541205bbfe64',1,'operator=(valarray< _Tp > &&__v) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga708c338c38f644c83fb4440add0a7f82',1,'operator=(const slice_array< _Tp > &__sa)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga975285295867516982cbd04e5416ca33',1,'operator=(const gslice_array< _Tp > &__ga)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga008f37655c6e6e55b37c9b46efd259c1',1,'operator=(const mask_array< _Tp > &__ma)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad58ef4619934cdeccb9b476c6e8ccceb',1,'operator=(const indirect_array< _Tp > &__ia)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga781c3cfba5752871b9b8df2717f3d301',1,'operator=(initializer_list< _Tp > __l)(Global Namespace)']]], + ['operator_3d_3d_122',['operator==',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#acf112fc545f9775e075edc49aba223c4',1,'cv::FileNodeIterator::operator==(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#acf112fc545f9775e075edc49aba223c4',1,'cv::FileNodeIterator::operator==(const FileNodeIterator &it1, const FileNodeIterator &it2)'],['https://docs.opencv.org/4.2.0/d7/dd5/structcv_1_1GArrayDesc.html#aa68591702df8e965af25f67215b9a025',1,'cv::GArrayDesc::operator==()'],['https://docs.opencv.org/4.2.0/db/d3a/classcv_1_1gapi_1_1GBackend.html#aa6626bdd5f1f55a5f29bad91cf8b891b',1,'cv::gapi::GBackend::operator==()'],['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a15c5b7fd785e239a1863f4658c1c53ac',1,'cv::GMatDesc::operator==()'],['https://docs.opencv.org/4.2.0/d4/d4d/classcv_1_1optflow_1_1GPCTree.html#a1f2bff8899fd6b72e574d48194bf283b',1,'cv::optflow::GPCTree::operator==()'],['https://docs.opencv.org/4.2.0/d1/d6a/structcv_1_1GScalarDesc.html#a36bdb1c38855e657126b600da4befb61',1,'cv::GScalarDesc::operator==()'],['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1linemod_1_1Match.html#a90841129d2fa56dc7713e51d668dd8b5',1,'cv::linemod::Match::operator==()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0f25efd0c1f254692fc60bda5f4c3353',1,'cv::MatExpr::operator==(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5516de530ce49cf1fdbfcedbc13fa64d',1,'cv::MatExpr::operator==(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2c23e8205bea3a64497638fe270e3a83',1,'cv::MatExpr::operator==(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab9e92650570e38003f74364c0d168157',1,'cv::MatExpr::operator==(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abb139508b5df77d1009612b438f53df5',1,'cv::MatExpr::operator==(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a0f25efd0c1f254692fc60bda5f4c3353',1,'cv::MatExpr::operator==(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5516de530ce49cf1fdbfcedbc13fa64d',1,'cv::MatExpr::operator==(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a2c23e8205bea3a64497638fe270e3a83',1,'cv::MatExpr::operator==(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ab9e92650570e38003f74364c0d168157',1,'cv::MatExpr::operator==(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abb139508b5df77d1009612b438f53df5',1,'cv::MatExpr::operator==(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#ae19097bf50bc486e072f340a295adb64',1,'cv::MatSize::operator==()'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'cv::Matx::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'cv::Matx::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< _Tp, cn, 1 >::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< _Tp, cn, 1 >::operator==(const Matx< _Tp, m, n > &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 1, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 1, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 2 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 2 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 2, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 3 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 3, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 4, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, 4, 4 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, cn, 1 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< double, cn, 1 >::operator==(const Matx< double, m, n > &a, const Matx< double, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 2, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 2, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 3, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, 3, 3 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, cn, 1 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float, cn, 1 >::operator==(const Matx< float, m, n > &a, const Matx< float, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float_type, 4, 4 >::operator==(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#adaf03dafd994f8de41007596ab747186',1,'Matx< float_type, 4, 4 >::operator==(const Matx< float_type, m, n > &a, const Matx< float_type, m, n > &b)'],['https://docs.opencv.org/4.2.0/d8/dde/structNcvSize32u.html#a447699c291cd1eb0786f1ee3b1570fb6',1,'NcvSize32u::operator==()'],['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#a30538c00fc6f3108318e8dea59aca435',1,'cv::optflow::GPCTree::Node::operator==()'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a6c4889ee703a2b667df1fa298ffa312f',1,'cv::RNG::operator==()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga972dee821ab26d61f11528b427131083',1,'cv::softdouble::operator==()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf9ae987f5788edbe1aada59dd7f41717',1,'cv::softfloat::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7acc944a17c34a7e6a1f46a18319abe7',1,'__gnu_pbds::detail::bin_search_tree_const_node_it_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11627.html#a7acc944a17c34a7e6a1f46a18319abe7',1,'__gnu_pbds::detail::bin_search_tree_node_it_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11571.html#a49be997a654cf31a5688f876b3a0926b',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator==(const binary_heap_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a086ba257226b242633bc6519023da110',1,'__gnu_pbds::detail::binary_heap_const_iterator_::operator==(const binary_heap_point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11607.html#a086ba257226b242633bc6519023da110',1,'__gnu_pbds::detail::binary_heap_point_const_iterator_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11799.html#ae75829a8ccd781a3914acd4e19e3ce3e',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator==(const left_child_next_sibling_heap_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a0a47dab89d7acfb414046e40887e3064',1,'__gnu_pbds::detail::left_child_next_sibling_heap_const_iterator_::operator==(const left_child_next_sibling_heap_node_point_const_iterator_< Node, _Alloc > &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11815.html#a0a47dab89d7acfb414046e40887e3064',1,'__gnu_pbds::detail::left_child_next_sibling_heap_node_point_const_iterator_::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a46409e64d8adbfd9be6a641313d150da',1,'__gnu_pbds::detail::pat_trie_base::_Node_citer::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11947.html#a46409e64d8adbfd9be6a641313d150da',1,'__gnu_pbds::detail::pat_trie_base::_Node_iter::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a71de2ddc1c6ba25e6e272c9da3a95318',1,'const_iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a866b2f6450ebeaa95ed1b6065451ad7d',1,'const_iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a71de2ddc1c6ba25e6e272c9da3a95318',1,'iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a866b2f6450ebeaa95ed1b6065451ad7d',1,'iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a71de2ddc1c6ba25e6e272c9da3a95318',1,'point_const_iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12099.html#a866b2f6450ebeaa95ed1b6065451ad7d',1,'point_const_iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#adfa598f9d27ae43c69743fa39fd49a05',1,'point_iterator_::operator==(const point_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a12103.html#aa326cdd6985b3c513e13027a420cc8d8',1,'point_iterator_::operator==(const point_const_iterator_ &other) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#affef282a5c1dde27d67a3ad667936c17',1,'std::bitset::operator==(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#affef282a5c1dde27d67a3ad667936c17',1,'std::bitset::operator==(const bitset< _Nb > &__rhs) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a0f58972cf0b98da7d1e751bba3f28f7e',1,'std::locale::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06775.html#adb0c9c95d8d972b0f68da2b1740bbc14',1,'std::regex_iterator::operator==()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06779.html#a075cbb0e00f38573d223b5590ac9c438',1,'std::regex_token_iterator::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a80e3e1e83fdf43f9f7fb6ff51836b24d',1,'Eigen::MatrixBase::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a80e3e1e83fdf43f9f7fb6ff51836b24d',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a80e3e1e83fdf43f9f7fb6ff51836b24d',1,'MatrixBase< Solve< Decomposition, RhsType > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'Eigen::QuaternionBase::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'QuaternionBase< Map< const Quaternion< _Scalar >, _Options > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'QuaternionBase< Map< Quaternion< _Scalar >, _Options > >::operator==()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1QuaternionBase.html#ad206c9014409c06970884dbfc00e6c3c',1,'QuaternionBase< Quaternion< _Scalar, _Options > >::operator==()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1byte__container__with__subtype_aee67fde9d3d571a07d5bb35df21c0555.html#aee67fde9d3d571a07d5bb35df21c0555',1,'nlohmann::byte_container_with_subtype::operator==()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga265437a0b1f89bf8f23abfc7a4851fe7',1,'cv::operator==()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ef7d0ea1a3ab83c7f256519308a844',1,'cv::cudev::operator==(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c03cd29116a3881ded8063f7b2ba14f',1,'cv::cudev::operator==(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f3a2eceff62c03cd9a882415b1c3f0',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a4d2f075d535c3ff86c0b6bf318e72',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c672631285cf71d4d1d4dbe0efce11f',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4251ba200887d1621e3666dab16287ab',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa06c320c4bd4a2b17768c4139c1a6293',1,'cv::cudev::operator==(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga528b1ebd894984f8761e8b8d88032fa7',1,'cv::cudev::operator==(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga911a544f2ecd6917b6b4e401bee9d8a5',1,'cv::cudev::operator==(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5dae5116c781ee0064d66d54eb3156d',1,'cv::cudev::operator==(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabc05ae0491425089c125d9df1d4cf71',1,'cv::cudev::operator==(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e265e4d4ec9c9ea2d10b024fa2ad5d5',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3176752b40d5162d7960321c5862a1a',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88f39c819d520a99b1e101b22de693ce',1,'cv::cudev::operator==(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf424cb9b34f4e8037d63be9ac57eacb8',1,'cv::cudev::operator==(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42690ed246813e13156ee7a94a6edfb8',1,'cv::cudev::operator==(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c2d540d34347146ca6fd7fc13362f18',1,'cv::cudev::operator==(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca47f7f9407e6fd8424aebc82a811283',1,'cv::cudev::operator==(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf63eee75bc9dfcd335ee6100a0ab2b6',1,'cv::cudev::operator==(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d000c2d62a0a2feb023cfce8912b2ef',1,'cv::cudev::operator==(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7b6cc4a40099563d92a21677659e0',1,'cv::cudev::operator==(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10206e51eb5cf79fc73525e83b18b74a',1,'cv::cudev::operator==(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3fb8521b5e67d3ff9ab4a7e1afad12',1,'cv::cudev::operator==(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fc754b6f5b8565f33507efb2275bfb6',1,'cv::cudev::operator==(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be39f600250879de5101123b66504b8',1,'cv::cudev::operator==(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfb79324be9e683545bb7002bc4ab28',1,'cv::cudev::operator==(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ee6639a7f89d8f34c3c6ef3612549c1',1,'cv::cudev::operator==(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4f48f70be081aacfd902bedf1e51fe',1,'cv::cudev::operator==(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c4da213e91b805e976aa524c708c00',1,'cv::cudev::operator==(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56c8ff40e1386ced3569766a16d8d4f',1,'cv::cudev::operator==(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7fd7e441fa19fc3d30891d4a72dd3d',1,'cv::cudev::operator==(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05bbbea75bff44d625777a0f747fa3d8',1,'cv::cudev::operator==(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga792515f0fb51d1d5ec3909796ca83210',1,'cv::cudev::operator==(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b07bce720a1685cb83bf8f41013a25f',1,'cv::cudev::operator==(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18dff9db2290860f6cc90b61deaa1b30',1,'cv::cudev::operator==(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b545fa1278af6ad8c1d637d3177eb10',1,'cv::cudev::operator==(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d099a82124c0e33bdcc5d5e74eaebb2',1,'cv::cudev::operator==(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6783ef41308862477ba5314de3e69d0',1,'cv::cudev::operator==(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4ed94a65ade2bd611d9abb6706e4a2c',1,'cv::cudev::operator==(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac651885fe279e2497a477cbfc1ede96f',1,'cv::cudev::operator==(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2039c53f02ea2409638a50ef3c6be3e',1,'cv::cudev::operator==(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga896fedd904924b35b5d2afcae58f3a0c',1,'cv::cudev::operator==(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cac30ae19e5ed19d98562f0dab48191',1,'cv::cudev::operator==(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeda02a903e1895363cf991717900cd5c',1,'cv::cudev::operator==(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35df58b1d78944360c0d0a1f79eaf903',1,'cv::cudev::operator==(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba49598153961051c9ddf282d36acf2',1,'cv::cudev::operator==(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dd4f1bc3a106a0ae0c8a202dc9b289e',1,'cv::cudev::operator==(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08afcea4414c4e8448351d208645e1d2',1,'cv::cudev::operator==(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa536847ec326ee826054043706320926',1,'cv::cudev::operator==(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1858de8e86a7d74dd5696a3da6622f00',1,'cv::cudev::operator==(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d443a79fa65df214fb74a750765eb33',1,'cv::cudev::operator==(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101069df9b8c98db50d7723eb2452905',1,'cv::cudev::operator==(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f964ff73b6a52ccbeef211ae1202c8',1,'cv::cudev::operator==(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52ca12e909e8009d33d169cc954eb8e6',1,'cv::cudev::operator==(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b6072969257533c8b1c24ae3a35c9a1',1,'cv::cudev::operator==(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59cdc36df6f9053bc413dd3a92522ba3',1,'cv::cudev::operator==(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga666c44211474c9a295525bca03433cee',1,'cv::cudev::operator==(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaea9ab37e1f2dd66c45b3283de613cbd',1,'cv::cudev::operator==(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56b745a12912d7e0b7ae22fd6297902',1,'cv::cudev::operator==(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e9304361fccde39db1ab2ae0c07f68',1,'cv::cudev::operator==(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec3b2bf74cd4ff6af94bb83bdf8783b4',1,'cv::cudev::operator==(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga128ceaedc10a626785f8ce09f554198a',1,'cv::cudev::operator==(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81f8f4793ee7c514eca370438997eb45',1,'cv::cudev::operator==(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1329e50637b7b5ac07100d3e263331d',1,'cv::cudev::operator==(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78683b47cb3562be1f4d48606497e409',1,'cv::cudev::operator==(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa32ae379c00e669b968b3090cd815e2a',1,'cv::cudev::operator==(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29a49819fa81a12fdb40418ecfed5085',1,'cv::cudev::operator==(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f3770d45d2f2184aefca17515d82fc8',1,'cv::cudev::operator==(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36065bc2f0c37455244db7f412296a59',1,'cv::cudev::operator==(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1c6ff78a4c2957eb469cce1e0d9892b',1,'cv::cudev::operator==(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24b60bc88c8796c3b7d230868e9d1e65',1,'cv::cudev::operator==(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0cf450da39a02ef534f92365e71eef9',1,'cv::cudev::operator==(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d7fcd75c972fae50f91d56bd0f815a',1,'cv::cudev::operator==(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dcbfffb2623cdd808a82387de219fdb',1,'cv::cudev::operator==(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76e79f2930fab6ae0c14b89445494a83',1,'cv::cudev::operator==(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3cb39b62df9f3c283aa768412fda24bc',1,'cv::cudev::operator==(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4940b8cdca244cec798fc5e12b96ed8e',1,'cv::cudev::operator==(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c906fac8d8e04f4c1b62ba525fd1617',1,'cv::cudev::operator==(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12c2c61f6d87749a497db6cb678835db',1,'cv::cudev::operator==(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd318fb104522620d4d12b98b93c8974',1,'cv::cudev::operator==(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff38bcfdc1dca4e5abfac0ca3b117fc',1,'cv::cudev::operator==(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ba83f60df077bb1b5654a2ee1afb367',1,'cv::cudev::operator==(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ec516b24d0b6b66b6419089b9bc0713',1,'cv::cudev::operator==(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c31130c36dc9b842e26fdaf680e00b6',1,'cv::cudev::operator==(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b31d6c71170412cae5061aa6ac19442',1,'cv::cudev::operator==(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecc2ba37fea0d1d795a2cab8ece45cc1',1,'cv::cudev::operator==(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e7ea06c654354b984128255037d55fd',1,'cv::cudev::operator==(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf30eab4cac32df44e33444bfe7b0070',1,'cv::cudev::operator==(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb69979b7b37bfd566ca1ab2da349c98',1,'cv::cudev::operator==(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7697781422bbb9de18a582f93388324c',1,'cv::cudev::operator==(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46152b0d4aabffb4ca701da3b541068b',1,'cv::cudev::operator==(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6fbc5b8438fe5bea85238b9d0c5f3e',1,'cv::cudev::operator==(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade08fcc308b2e20d50c4a3438fe4b6ee',1,'cv::cudev::operator==(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae34b2a72fe4150e858465a7769ee2c52',1,'cv::cudev::operator==(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0c0ceb6055acb375303cecd49634749',1,'cv::cudev::operator==(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3eff50212ed2892cd6fe4b8d19dd3a2a',1,'cv::cudev::operator==(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga853c4c648ea2ed3ba048ed254fa6f394',1,'cv::cudev::operator==(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96ad2da041f97e4dc0ea14e0da62fe96',1,'cv::cudev::operator==(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5346316989e032dda02d05565286aba1',1,'cv::cudev::operator==(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80fad755179790ebd605e94301d180ef',1,'cv::cudev::operator==(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3123a45c875b4eb9a41975aa969b6db5',1,'cv::cudev::operator==(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63e43865abdcf4a38d39a5eb89729f63',1,'cv::cudev::operator==(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5a0f9e14535efa9de7e727cef2f9bcd',1,'cv::cudev::operator==(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa49d3faa449c6996a36b4cfe9bc746e7',1,'cv::cudev::operator==(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89677a515b08e742fc50a35d1798fc03',1,'cv::cudev::operator==(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9447ed9200cf81281050367c324bdf10',1,'cv::cudev::operator==(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabee6ab2431bb58230e98a0ede9c6d337',1,'cv::cudev::operator==(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42afbc516bbfa01e1310a9bab908702',1,'cv::cudev::operator==(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0a74127fa51af116df67364acd93bd3',1,'cv::cudev::operator==(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e730bd659adc74654d92449dad36b9d',1,'cv::cudev::operator==(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga346d65131b0e3c9e3ac61de5176606a8',1,'cv::cudev::operator==(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa30c0df3a7b04d70749c2ab8b6fff5fe',1,'cv::cudev::operator==(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec539fea1d620f685a11e9d391f78afd',1,'cv::cudev::operator==(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b435363def80bdc86a9841a802a2ca',1,'cv::cudev::operator==(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1153ecbaadb6527bf4913cc87d984850',1,'cv::cudev::operator==(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9127ac6fce50f851f7d47463fa632fbf',1,'cv::cudev::operator==(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga612438c13d01ed44d78967a7febf0eb0',1,'cv::cudev::operator==(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00a17f5eee9ac60ccb1ababf1fd1e73b',1,'cv::cudev::operator==(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd8701578ccdf15bc6cbb4d3d5517c9',1,'cv::cudev::operator==(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2bb15eb31a7a24d0434a3a131d06d8',1,'cv::cudev::operator==(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/d0/d1a/namespacecv_1_1gapi_1_1fluid.html#a10b8ba4730d3e056eb20a3ec7b1cee96',1,'cv::gapi::fluid::operator==()'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#adc6dd73da3e9d530ba62bb4de813ce59',1,'cv::gapi::own::operator==(const Scalar &lhs, const Scalar &rhs)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#a67f8ec451661ed549feca91a814d84e9',1,'cv::gapi::own::operator==(const Rect &lhs, const Rect &rhs)'],['https://docs.opencv.org/4.2.0/d6/d7d/namespacecv_1_1gapi_1_1own.html#aa2f43bcd90b89230eadc4556a534cf0d',1,'cv::gapi::own::operator==(const Size &lhs, const Size &rhs)'],['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a3025fa7e3d6892a5ee2144bf3b564c22',1,'cv::instr::operator==()'],['https://docs.opencv.org/4.2.0/d1/d55/namespacecv_1_1tbm.html#ad1e6cef1a8e7e7dbed38321d38691c9d',1,'cv::tbm::operator==()'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a4d75335a7cc12c0d62a854c9151e02d2',1,'cv::util::operator==(const util::monostate &, const util::monostate &)'],['https://docs.opencv.org/4.2.0/d3/dce/namespacecv_1_1util.html#a671a36e09de46881212b09f980d86b00',1,'cv::util::operator==(const variant< Us... > &lhs, const variant< Us... > &rhs)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#gaf9ae987f5788edbe1aada59dd7f41717',1,'operator==(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga972dee821ab26d61f11528b427131083',1,'operator==(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga265437a0b1f89bf8f23abfc7a4851fe7',1,'operator==(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80ef7d0ea1a3ab83c7f256519308a844',1,'operator==(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c03cd29116a3881ded8063f7b2ba14f',1,'operator==(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44f3a2eceff62c03cd9a882415b1c3f0',1,'operator==(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a4d2f075d535c3ff86c0b6bf318e72',1,'operator==(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c672631285cf71d4d1d4dbe0efce11f',1,'operator==(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4251ba200887d1621e3666dab16287ab',1,'operator==(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa06c320c4bd4a2b17768c4139c1a6293',1,'operator==(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga528b1ebd894984f8761e8b8d88032fa7',1,'operator==(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga911a544f2ecd6917b6b4e401bee9d8a5',1,'operator==(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5dae5116c781ee0064d66d54eb3156d',1,'operator==(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabc05ae0491425089c125d9df1d4cf71',1,'operator==(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e265e4d4ec9c9ea2d10b024fa2ad5d5',1,'operator==(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3176752b40d5162d7960321c5862a1a',1,'operator==(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88f39c819d520a99b1e101b22de693ce',1,'operator==(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf424cb9b34f4e8037d63be9ac57eacb8',1,'operator==(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42690ed246813e13156ee7a94a6edfb8',1,'operator==(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c2d540d34347146ca6fd7fc13362f18',1,'operator==(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca47f7f9407e6fd8424aebc82a811283',1,'operator==(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf63eee75bc9dfcd335ee6100a0ab2b6',1,'operator==(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d000c2d62a0a2feb023cfce8912b2ef',1,'operator==(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaada7b6cc4a40099563d92a21677659e0',1,'operator==(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga10206e51eb5cf79fc73525e83b18b74a',1,'operator==(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd3fb8521b5e67d3ff9ab4a7e1afad12',1,'operator==(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6fc754b6f5b8565f33507efb2275bfb6',1,'operator==(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8be39f600250879de5101123b66504b8',1,'operator==(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cfb79324be9e683545bb7002bc4ab28',1,'operator==(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ee6639a7f89d8f34c3c6ef3612549c1',1,'operator==(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2f4f48f70be081aacfd902bedf1e51fe',1,'operator==(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga40c4da213e91b805e976aa524c708c00',1,'operator==(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56c8ff40e1386ced3569766a16d8d4f',1,'operator==(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e7fd7e441fa19fc3d30891d4a72dd3d',1,'operator==(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05bbbea75bff44d625777a0f747fa3d8',1,'operator==(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga792515f0fb51d1d5ec3909796ca83210',1,'operator==(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b07bce720a1685cb83bf8f41013a25f',1,'operator==(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga18dff9db2290860f6cc90b61deaa1b30',1,'operator==(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b545fa1278af6ad8c1d637d3177eb10',1,'operator==(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d099a82124c0e33bdcc5d5e74eaebb2',1,'operator==(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6783ef41308862477ba5314de3e69d0',1,'operator==(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4ed94a65ade2bd611d9abb6706e4a2c',1,'operator==(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac651885fe279e2497a477cbfc1ede96f',1,'operator==(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2039c53f02ea2409638a50ef3c6be3e',1,'operator==(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga896fedd904924b35b5d2afcae58f3a0c',1,'operator==(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8cac30ae19e5ed19d98562f0dab48191',1,'operator==(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeda02a903e1895363cf991717900cd5c',1,'operator==(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35df58b1d78944360c0d0a1f79eaf903',1,'operator==(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ba49598153961051c9ddf282d36acf2',1,'operator==(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4dd4f1bc3a106a0ae0c8a202dc9b289e',1,'operator==(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08afcea4414c4e8448351d208645e1d2',1,'operator==(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa536847ec326ee826054043706320926',1,'operator==(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1858de8e86a7d74dd5696a3da6622f00',1,'operator==(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d443a79fa65df214fb74a750765eb33',1,'operator==(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga101069df9b8c98db50d7723eb2452905',1,'operator==(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09f964ff73b6a52ccbeef211ae1202c8',1,'operator==(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga52ca12e909e8009d33d169cc954eb8e6',1,'operator==(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b6072969257533c8b1c24ae3a35c9a1',1,'operator==(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59cdc36df6f9053bc413dd3a92522ba3',1,'operator==(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga666c44211474c9a295525bca03433cee',1,'operator==(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaea9ab37e1f2dd66c45b3283de613cbd',1,'operator==(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae56b745a12912d7e0b7ae22fd6297902',1,'operator==(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73e9304361fccde39db1ab2ae0c07f68',1,'operator==(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec3b2bf74cd4ff6af94bb83bdf8783b4',1,'operator==(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga128ceaedc10a626785f8ce09f554198a',1,'operator==(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81f8f4793ee7c514eca370438997eb45',1,'operator==(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1329e50637b7b5ac07100d3e263331d',1,'operator==(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78683b47cb3562be1f4d48606497e409',1,'operator==(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa32ae379c00e669b968b3090cd815e2a',1,'operator==(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29a49819fa81a12fdb40418ecfed5085',1,'operator==(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f3770d45d2f2184aefca17515d82fc8',1,'operator==(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga36065bc2f0c37455244db7f412296a59',1,'operator==(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae1c6ff78a4c2957eb469cce1e0d9892b',1,'operator==(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24b60bc88c8796c3b7d230868e9d1e65',1,'operator==(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac0cf450da39a02ef534f92365e71eef9',1,'operator==(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91d7fcd75c972fae50f91d56bd0f815a',1,'operator==(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7dcbfffb2623cdd808a82387de219fdb',1,'operator==(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga76e79f2930fab6ae0c14b89445494a83',1,'operator==(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3cb39b62df9f3c283aa768412fda24bc',1,'operator==(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4940b8cdca244cec798fc5e12b96ed8e',1,'operator==(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c906fac8d8e04f4c1b62ba525fd1617',1,'operator==(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga12c2c61f6d87749a497db6cb678835db',1,'operator==(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd318fb104522620d4d12b98b93c8974',1,'operator==(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ff38bcfdc1dca4e5abfac0ca3b117fc',1,'operator==(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ba83f60df077bb1b5654a2ee1afb367',1,'operator==(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ec516b24d0b6b66b6419089b9bc0713',1,'operator==(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c31130c36dc9b842e26fdaf680e00b6',1,'operator==(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0b31d6c71170412cae5061aa6ac19442',1,'operator==(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecc2ba37fea0d1d795a2cab8ece45cc1',1,'operator==(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e7ea06c654354b984128255037d55fd',1,'operator==(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf30eab4cac32df44e33444bfe7b0070',1,'operator==(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb69979b7b37bfd566ca1ab2da349c98',1,'operator==(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7697781422bbb9de18a582f93388324c',1,'operator==(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46152b0d4aabffb4ca701da3b541068b',1,'operator==(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a6fbc5b8438fe5bea85238b9d0c5f3e',1,'operator==(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade08fcc308b2e20d50c4a3438fe4b6ee',1,'operator==(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae34b2a72fe4150e858465a7769ee2c52',1,'operator==(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0c0ceb6055acb375303cecd49634749',1,'operator==(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3eff50212ed2892cd6fe4b8d19dd3a2a',1,'operator==(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga853c4c648ea2ed3ba048ed254fa6f394',1,'operator==(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96ad2da041f97e4dc0ea14e0da62fe96',1,'operator==(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5346316989e032dda02d05565286aba1',1,'operator==(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80fad755179790ebd605e94301d180ef',1,'operator==(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3123a45c875b4eb9a41975aa969b6db5',1,'operator==(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63e43865abdcf4a38d39a5eb89729f63',1,'operator==(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab5a0f9e14535efa9de7e727cef2f9bcd',1,'operator==(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa49d3faa449c6996a36b4cfe9bc746e7',1,'operator==(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89677a515b08e742fc50a35d1798fc03',1,'operator==(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9447ed9200cf81281050367c324bdf10',1,'operator==(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabee6ab2431bb58230e98a0ede9c6d337',1,'operator==(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae42afbc516bbfa01e1310a9bab908702',1,'operator==(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0a74127fa51af116df67364acd93bd3',1,'operator==(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e730bd659adc74654d92449dad36b9d',1,'operator==(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga346d65131b0e3c9e3ac61de5176606a8',1,'operator==(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa30c0df3a7b04d70749c2ab8b6fff5fe',1,'operator==(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaec539fea1d620f685a11e9d391f78afd',1,'operator==(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf7b435363def80bdc86a9841a802a2ca',1,'operator==(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1153ecbaadb6527bf4913cc87d984850',1,'operator==(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9127ac6fce50f851f7d47463fa632fbf',1,'operator==(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga612438c13d01ed44d78967a7febf0eb0',1,'operator==(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00a17f5eee9ac60ccb1ababf1fd1e73b',1,'operator==(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacd8701578ccdf15bc6cbb4d3d5517c9',1,'operator==(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a2bb15eb31a7a24d0434a3a131d06d8',1,'operator==(double s, const double1 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ae7f71d536da5bf14e2d75305b4b88da5',1,'__gnu_cxx::operator==(const _Pointer_adapter< _Tp > &__lhs, const _Pointer_adapter< _Tp > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#acbaf9ba3f0e9c26a8239a313ad714fa8',1,'__gnu_cxx::operator==(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#ad0ff7d116cd8134193d3d843552d750c',1,'__gnu_cxx::operator==(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a20ca06133e85c3a0ea49857488a5b94c',1,'__gnu_cxx::operator==(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga0431ac39f84ec7f88d6bdb9db72bd5b9',1,'std::operator==(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a50d898f211d37c5a47907f462b0b17f1',1,'std::operator==(const fpos< _StateT > &__lhs, const fpos< _StateT > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a05fbef1e7e15558f5933ed15a339e97d',1,'std::operator==(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#gaadf1270d8fcc1bdae9a699e3d85c7986',1,'std::operator==(const reverse_iterator< _Iterator > &__x, const reverse_iterator< _Iterator > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7aeb223367d887a2b7f358a50e15e6f2',1,'std::operator==(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga5559f33b5ba6dbf83e961888d324dd40',1,'std::operator==(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad2629e7ee31ca36d6d593639e698db6b',1,'std::operator==(const function< _Res(_Args...)> &__f, nullptr_t) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a225870d9721816ebaa535af4e19d0cc1',1,'std::operator==(nullptr_t, const function< _Res(_Args...)> &__f) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ada60c841e9fe08814304ae79d35267de',1,'std::operator==(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aeed20ec23d92debc5bd1a0c0ee6c1b52',1,'std::operator==(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga89f3784efc6a944b4857408f1fcf7f3b',1,'std::operator==(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga811c7e6a67b83ef003e899c4ea93b910',1,'std::operator==(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5d6c242794f6d1866eb9cc58678ce8b1',1,'std::operator==(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae583f778cadadef72db1f8afaa7bc4a1',1,'std::operator==(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga472d58de0896c76b3d402dbf27aa75c8',1,'std::operator==(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae4390d0b1712ee5334c61da6e0576d08',1,'std::operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga51b1c9a2beb5254d11c13dbc22a8e379',1,'std::operator==(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ada41d3682184f0d0d8525907fdfcbea8',1,'std::operator==(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a2cc59dba70d0427b9e006411b37aee81',1,'std::operator==(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaac6078c1098e92d740d6d226f1c5e3dd',1,'std::operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa823b88deb57ba1b2494ea0dbcc028a8',1,'std::operator==(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aa2053d06d62313a4cde70f0f1d1f04c0',1,'std::operator==(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafcc9a7386753edf6a626ce090f9d4cd3',1,'std::operator==(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a60c2de42339c226dbeaeb60ef54b7bd2',1,'std::operator==(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a648834d2b253af7787093fe9156662f5',1,'std::operator==(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aecebb49b7915414fe7fd3eaff7c8516c',1,'std::operator==(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4edac9ce553e84f7c97c02172d93424e',1,'std::operator==(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaca932655bd64e8b079c145921e0d1d62',1,'std::operator==(const complex< _Tp > &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5bbecf180e08f24cdb60411af07873be',1,'std::operator==(const complex< _Tp > &__x, const _Tp &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga8ce82b2067ebaf21931151dfee549f0d',1,'std::operator==(const _Tp &__x, const complex< _Tp > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaca932655bd64e8b079c145921e0d1d62',1,'operator==(const complex< _Tp > &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga5bbecf180e08f24cdb60411af07873be',1,'operator==(const complex< _Tp > &__x, const _Tp &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#ga8ce82b2067ebaf21931151dfee549f0d',1,'operator==(const _Tp &__x, const complex< _Tp > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#ga0431ac39f84ec7f88d6bdb9db72bd5b9',1,'operator==(const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__x, const istream_iterator< _Tp, _CharT, _Traits, _Dist > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html#gaadf1270d8fcc1bdae9a699e3d85c7986',1,'operator==(const reverse_iterator< _Iterator > &__x, const reverse_iterator< _Iterator > &__y)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga89f3784efc6a944b4857408f1fcf7f3b',1,'operator==(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga811c7e6a67b83ef003e899c4ea93b910',1,'operator==(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae583f778cadadef72db1f8afaa7bc4a1',1,'operator==(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga472d58de0896c76b3d402dbf27aa75c8',1,'operator==(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gae4390d0b1712ee5334c61da6e0576d08',1,'operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga51b1c9a2beb5254d11c13dbc22a8e379',1,'operator==(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaac6078c1098e92d740d6d226f1c5e3dd',1,'operator==(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gafcc9a7386753edf6a626ce090f9d4cd3',1,'operator==(const match_results< _Bi_iter, _Alloc > &__m1, const match_results< _Bi_iter, _Alloc > &__m2) noexcept(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga5559f33b5ba6dbf83e961888d324dd40',1,'operator==(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], + ['operator_3e_123',['operator>',['https://docs.opencv.org/4.2.0/d5/dca/structcv_1_1detail_1_1GraphEdge.html#a02573cd46ba9f4cf2fa8e7b40cde41df',1,'cv::detail::GraphEdge::operator>()'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a85401ad9773e0afda99ae87137f26b6d',1,'cv::MatExpr::operator>(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae14822d723b02a44dcc6b9dc66b9d2d6',1,'cv::MatExpr::operator>(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#affc3d68c3891df1237e9a9bd96856c8c',1,'cv::MatExpr::operator>(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a35767a6160d961e75fbc3613e1b9f0a5',1,'cv::MatExpr::operator>(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a28ec289f14a0c25c6e9d1a596318ede3',1,'cv::MatExpr::operator>(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a85401ad9773e0afda99ae87137f26b6d',1,'cv::MatExpr::operator>(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae14822d723b02a44dcc6b9dc66b9d2d6',1,'cv::MatExpr::operator>(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#affc3d68c3891df1237e9a9bd96856c8c',1,'cv::MatExpr::operator>(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a35767a6160d961e75fbc3613e1b9f0a5',1,'cv::MatExpr::operator>(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a28ec289f14a0c25c6e9d1a596318ede3',1,'cv::MatExpr::operator>(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga89a6048ae27277f5f84458078a447a7b',1,'cv::softdouble::operator>()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9e6bd3f5911bf05d858b143d76813b13',1,'cv::softfloat::operator>()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga53b1ef03655e02eabf49238a5927f384',1,'cv::operator>()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf76a5cbe9661c03341fed10338283b3a',1,'cv::cudev::operator>(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35b979bc99aa0c19b8b03d0191c0aef',1,'cv::cudev::operator>(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fe6218c267adf7bf750b607bcee1dde',1,'cv::cudev::operator>(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557a3a12df84d433097b5f1df0d7d04',1,'cv::cudev::operator>(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga192ad383159b69ca2292f072b38508f9',1,'cv::cudev::operator>(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd71f8794eb458670da81e6e31ebd40d',1,'cv::cudev::operator>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga805cfea7bfd59489c103d6ea068e5dd8',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga876bfb5116ae02ad4707fb201477a535',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58c9c31838a279487423f7f3582c4913',1,'cv::cudev::operator>(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c5037a273d23375d3020863519e7732',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81c1cf50caa6fdfec4decace6bfacbff',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9020160028347e36054f9780e546ad2',1,'cv::cudev::operator>(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09090c1f87b4fcc6c50a59befc7b7d1',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5762932e36ee52fdf93dc9af9a9ae5f',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga631a8e54c62472f3efd66b05c220ac99',1,'cv::cudev::operator>(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ca5edb7aebb689a224b13a06da7c096',1,'cv::cudev::operator>(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92f4356bcda49befcae07fe5897806ef',1,'cv::cudev::operator>(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga462d276943a4befba6bd1e5f7597ab43',1,'cv::cudev::operator>(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab987b25924d83dcbbb586e8c82b54457',1,'cv::cudev::operator>(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab42431af22ff2b15ff34bc2ca158d648',1,'cv::cudev::operator>(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ecf652b96c5cf329f62e04e798c7938',1,'cv::cudev::operator>(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6181bf9f0fc217c2fa0062df7dd997',1,'cv::cudev::operator>(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78139b6caee2bfff7f7e416fd4c0fa86',1,'cv::cudev::operator>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33f4d71b881eec12c81fa08710e13b90',1,'cv::cudev::operator>(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa24e4c795c4f9dff281f74e4a49517',1,'cv::cudev::operator>(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga979bbc65c1aa9cb961473faeec0c001d',1,'cv::cudev::operator>(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga763bba01a3388aa4241f24b934a36b9e',1,'cv::cudev::operator>(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a322f89d75c39df09b42d571cde02c',1,'cv::cudev::operator>(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadea03e1ebb6998d08fe7e356fc675da4',1,'cv::cudev::operator>(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfd53947e82410ed70ef8af8e469be95',1,'cv::cudev::operator>(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00fc760015647c4518fc1c250b34f3a0',1,'cv::cudev::operator>(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aac1815665d44067eae7d8cb4e4be40',1,'cv::cudev::operator>(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53328b4712dbd36f5bc5fc303973997c',1,'cv::cudev::operator>(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fcd4b8ca094ed23e6c523f312c075b8',1,'cv::cudev::operator>(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e9ae77beea1adff95bca10ef7401942',1,'cv::cudev::operator>(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga208a8ecd6574e328b8b89dce3d96550a',1,'cv::cudev::operator>(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeba9c5a1af22468fa4de9e27a7291c17',1,'cv::cudev::operator>(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60ce8fe5baf2a39a1963c206fe8f2283',1,'cv::cudev::operator>(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3605088dd4d00bc3d812c01485e0c854',1,'cv::cudev::operator>(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae77b149d4b2eda29c2d2e09c7a265f1',1,'cv::cudev::operator>(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9707f1f0bd1f08a43c8c6faaf389ef',1,'cv::cudev::operator>(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa790adfb4f6f2fa460c244f2f7621ed3',1,'cv::cudev::operator>(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeed166390fcd3b6634764bad3f4dfe99',1,'cv::cudev::operator>(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd896dcb0ea5b24ddf9a17b006ed2701',1,'cv::cudev::operator>(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae003f99da4c8129f3ce6908560dd6598',1,'cv::cudev::operator>(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac94d95ec080ec57be5729ff0a14d6740',1,'cv::cudev::operator>(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3292736e722c948bfee81f8ce13d285',1,'cv::cudev::operator>(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eadb9c719cbffb8161d58910fc8bf13',1,'cv::cudev::operator>(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5aa17050b6e23908154a490b186e5592',1,'cv::cudev::operator>(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad280748a5ba0aaef06f5f48f8d162fd0',1,'cv::cudev::operator>(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga122cfa74c83428505a928ea12d304942',1,'cv::cudev::operator>(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a4586e4cf8cd4353f49b0ac4d474553',1,'cv::cudev::operator>(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39b292f62396880cbe964128a125a2a8',1,'cv::cudev::operator>(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557ed1e9462d24223497a0c53db7d90',1,'cv::cudev::operator>(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b85167fb47e745fce108d23ae3674e0',1,'cv::cudev::operator>(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef695f029df417b63799eff1f8e20218',1,'cv::cudev::operator>(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdda92bd64d36ec1d43b5ce270677166',1,'cv::cudev::operator>(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff20e4d2dbcb670af32bba301c579fbc',1,'cv::cudev::operator>(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ec6a668ce4bdaee3fb96cd6af71bd59',1,'cv::cudev::operator>(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1eba4d1da0623f9c69a57db9e769144',1,'cv::cudev::operator>(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ed513d4cb9e4110d3db70f50be835ba',1,'cv::cudev::operator>(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fbdf61b01310dfb036bb6ffef461b8a',1,'cv::cudev::operator>(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab1a02c460ac72367d4652923fba630b',1,'cv::cudev::operator>(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga293527eeddad289a3efad53f1a4b6f3f',1,'cv::cudev::operator>(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadc84b344cba3e9d8279cce4daa335a3',1,'cv::cudev::operator>(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae6976ca05a71a3867491b1d63a38d79',1,'cv::cudev::operator>(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4d496fb1ee18b3cd918b6a3092c629',1,'cv::cudev::operator>(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9683b0f490d61333a0c9b0ac6177c797',1,'cv::cudev::operator>(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf173de4fa9a66e44f6e01e46e50fb96e',1,'cv::cudev::operator>(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6961930505501ab67e70de1bec1fc7c',1,'cv::cudev::operator>(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3be2422dd410d768a47a1523612c6e2',1,'cv::cudev::operator>(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga231392fd7250c8b1cba1027db6dd2f59',1,'cv::cudev::operator>(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7365378eede3da961a558ff603f0a8f2',1,'cv::cudev::operator>(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a4ad2ef4e95c53079cda25bcb76fc53',1,'cv::cudev::operator>(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga337362bc409dec3c7470826563fd08d5',1,'cv::cudev::operator>(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a78dc7183016b7eaa8994891ac7349e',1,'cv::cudev::operator>(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb89d12f168130b16b6a852fbcf29ac1',1,'cv::cudev::operator>(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd0188a961cefcfb26b7b15fac712e82',1,'cv::cudev::operator>(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13fc85d9e1c15b1d1d2c862936ab29cf',1,'cv::cudev::operator>(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6d6be81f2d1ad7424d414f6028a6dfd',1,'cv::cudev::operator>(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c3a579dea9a2c50a6082bf7c5c50d1f',1,'cv::cudev::operator>(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c88870704b2df7f664851aed891ab38',1,'cv::cudev::operator>(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabfe335f05bb7a355f8e2cf6d4ad83c3',1,'cv::cudev::operator>(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444c5e1f7f62cf798066d5659366df23',1,'cv::cudev::operator>(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab561641feed35c20278ece35bb8797b3',1,'cv::cudev::operator>(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b861ce2de51abdd03593b3d3d84f684',1,'cv::cudev::operator>(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c1fd7fbe4e5985f1d2fa725731eb08',1,'cv::cudev::operator>(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9e6afe8941f12362335b1a80e42496',1,'cv::cudev::operator>(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9896d8eed5804f7d4900f8b8266295ba',1,'cv::cudev::operator>(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca64d102ed2cfae7f3abeb781421204',1,'cv::cudev::operator>(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac833608b2481b20d0d91a71036d45d',1,'cv::cudev::operator>(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2237c47c62d003ee6a19ff2b3cd54b2',1,'cv::cudev::operator>(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990332db3565090a646987254c79fab4',1,'cv::cudev::operator>(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4e587facdf3b1a86a40be230639efef',1,'cv::cudev::operator>(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67f6d1cb7b1b325a6dfe5414dbb94dbd',1,'cv::cudev::operator>(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98a98af64c25c869aae0f4ad0c55af4',1,'cv::cudev::operator>(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fd6dc47e174621164179fbf737f2809',1,'cv::cudev::operator>(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd34ffd2648022fee481fe264945565c',1,'cv::cudev::operator>(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c9c2d7a26f8d9c7b8834f9f190a8914',1,'cv::cudev::operator>(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga640d6afcfb462ced93eefa1b697cd060',1,'cv::cudev::operator>(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa37cb32841f9ffa14b1936e05a1ebe9',1,'cv::cudev::operator>(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e97195a2b7cecf5ede8e47d260723c',1,'cv::cudev::operator>(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga335811f06efddba5e75ce0116d04783a',1,'cv::cudev::operator>(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa4f074c9ea9489fd8b41157998c5fed',1,'cv::cudev::operator>(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f1e7ce1a6510265ead6b6207f39effc',1,'cv::cudev::operator>(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9756cee47606a4de0ca1c3c8e97a40b2',1,'cv::cudev::operator>(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d783278f798a238eb375b58e4eeade4',1,'cv::cudev::operator>(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab439a8c37814ba930d4f4f0d15095883',1,'cv::cudev::operator>(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad508ec58830cc1077eb07e8fc153fd',1,'cv::cudev::operator>(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga408471782e6c3338d5ee9de16e31644e',1,'cv::cudev::operator>(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35415f4fd50ebd8a203fef079c54ec8d',1,'cv::cudev::operator>(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14fe180ed1d9c9666c46e88a36c421a8',1,'cv::cudev::operator>(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab45d33bf92b38f1331208282fda45064',1,'cv::cudev::operator>(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c384571fec644fe63911fd26bf6e6b',1,'cv::cudev::operator>(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31473d08b4bb642729365caf9a6c0e39',1,'cv::cudev::operator>(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa100c0ecc7e8aec9341b40562ac55b3a',1,'cv::cudev::operator>(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb98ebc2ade19b8e960fa40f5d6a253e',1,'cv::cudev::operator>(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eaa0d1ca6c4bb54774350171b9e16b5',1,'cv::cudev::operator>(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6458afcdc07e562050e4315122f859d2',1,'cv::cudev::operator>(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d2cc8c1b0507e85f915853485ecc6d0',1,'cv::cudev::operator>(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga9e6bd3f5911bf05d858b143d76813b13',1,'operator>(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga89a6048ae27277f5f84458078a447a7b',1,'operator>(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga53b1ef03655e02eabf49238a5927f384',1,'operator>(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf76a5cbe9661c03341fed10338283b3a',1,'operator>(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab35b979bc99aa0c19b8b03d0191c0aef',1,'operator>(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9fe6218c267adf7bf750b607bcee1dde',1,'operator>(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557a3a12df84d433097b5f1df0d7d04',1,'operator>(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga192ad383159b69ca2292f072b38508f9',1,'operator>(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd71f8794eb458670da81e6e31ebd40d',1,'operator>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga805cfea7bfd59489c103d6ea068e5dd8',1,'operator>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga876bfb5116ae02ad4707fb201477a535',1,'operator>(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga58c9c31838a279487423f7f3582c4913',1,'operator>(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c5037a273d23375d3020863519e7732',1,'operator>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga81c1cf50caa6fdfec4decace6bfacbff',1,'operator>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae9020160028347e36054f9780e546ad2',1,'operator>(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae09090c1f87b4fcc6c50a59befc7b7d1',1,'operator>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5762932e36ee52fdf93dc9af9a9ae5f',1,'operator>(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga631a8e54c62472f3efd66b05c220ac99',1,'operator>(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ca5edb7aebb689a224b13a06da7c096',1,'operator>(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92f4356bcda49befcae07fe5897806ef',1,'operator>(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga462d276943a4befba6bd1e5f7597ab43',1,'operator>(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab987b25924d83dcbbb586e8c82b54457',1,'operator>(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab42431af22ff2b15ff34bc2ca158d648',1,'operator>(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ecf652b96c5cf329f62e04e798c7938',1,'operator>(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b6181bf9f0fc217c2fa0062df7dd997',1,'operator>(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga78139b6caee2bfff7f7e416fd4c0fa86',1,'operator>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33f4d71b881eec12c81fa08710e13b90',1,'operator>(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa24e4c795c4f9dff281f74e4a49517',1,'operator>(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga979bbc65c1aa9cb961473faeec0c001d',1,'operator>(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga763bba01a3388aa4241f24b934a36b9e',1,'operator>(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga80a322f89d75c39df09b42d571cde02c',1,'operator>(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadea03e1ebb6998d08fe7e356fc675da4',1,'operator>(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabfd53947e82410ed70ef8af8e469be95',1,'operator>(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga00fc760015647c4518fc1c250b34f3a0',1,'operator>(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aac1815665d44067eae7d8cb4e4be40',1,'operator>(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53328b4712dbd36f5bc5fc303973997c',1,'operator>(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fcd4b8ca094ed23e6c523f312c075b8',1,'operator>(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e9ae77beea1adff95bca10ef7401942',1,'operator>(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga208a8ecd6574e328b8b89dce3d96550a',1,'operator>(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeba9c5a1af22468fa4de9e27a7291c17',1,'operator>(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga60ce8fe5baf2a39a1963c206fe8f2283',1,'operator>(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3605088dd4d00bc3d812c01485e0c854',1,'operator>(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae77b149d4b2eda29c2d2e09c7a265f1',1,'operator>(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5e9707f1f0bd1f08a43c8c6faaf389ef',1,'operator>(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa790adfb4f6f2fa460c244f2f7621ed3',1,'operator>(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeed166390fcd3b6634764bad3f4dfe99',1,'operator>(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabd896dcb0ea5b24ddf9a17b006ed2701',1,'operator>(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae003f99da4c8129f3ce6908560dd6598',1,'operator>(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac94d95ec080ec57be5729ff0a14d6740',1,'operator>(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3292736e722c948bfee81f8ce13d285',1,'operator>(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eadb9c719cbffb8161d58910fc8bf13',1,'operator>(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5aa17050b6e23908154a490b186e5592',1,'operator>(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad280748a5ba0aaef06f5f48f8d162fd0',1,'operator>(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga122cfa74c83428505a928ea12d304942',1,'operator>(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a4586e4cf8cd4353f49b0ac4d474553',1,'operator>(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga39b292f62396880cbe964128a125a2a8',1,'operator>(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0557ed1e9462d24223497a0c53db7d90',1,'operator>(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b85167fb47e745fce108d23ae3674e0',1,'operator>(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef695f029df417b63799eff1f8e20218',1,'operator>(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdda92bd64d36ec1d43b5ce270677166',1,'operator>(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff20e4d2dbcb670af32bba301c579fbc',1,'operator>(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9ec6a668ce4bdaee3fb96cd6af71bd59',1,'operator>(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1eba4d1da0623f9c69a57db9e769144',1,'operator>(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3ed513d4cb9e4110d3db70f50be835ba',1,'operator>(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7fbdf61b01310dfb036bb6ffef461b8a',1,'operator>(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaab1a02c460ac72367d4652923fba630b',1,'operator>(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga293527eeddad289a3efad53f1a4b6f3f',1,'operator>(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaadc84b344cba3e9d8279cce4daa335a3',1,'operator>(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae6976ca05a71a3867491b1d63a38d79',1,'operator>(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f4d496fb1ee18b3cd918b6a3092c629',1,'operator>(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9683b0f490d61333a0c9b0ac6177c797',1,'operator>(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf173de4fa9a66e44f6e01e46e50fb96e',1,'operator>(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6961930505501ab67e70de1bec1fc7c',1,'operator>(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3be2422dd410d768a47a1523612c6e2',1,'operator>(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga231392fd7250c8b1cba1027db6dd2f59',1,'operator>(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7365378eede3da961a558ff603f0a8f2',1,'operator>(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a4ad2ef4e95c53079cda25bcb76fc53',1,'operator>(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga337362bc409dec3c7470826563fd08d5',1,'operator>(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a78dc7183016b7eaa8994891ac7349e',1,'operator>(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb89d12f168130b16b6a852fbcf29ac1',1,'operator>(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd0188a961cefcfb26b7b15fac712e82',1,'operator>(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga13fc85d9e1c15b1d1d2c862936ab29cf',1,'operator>(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab6d6be81f2d1ad7424d414f6028a6dfd',1,'operator>(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c3a579dea9a2c50a6082bf7c5c50d1f',1,'operator>(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c88870704b2df7f664851aed891ab38',1,'operator>(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaabfe335f05bb7a355f8e2cf6d4ad83c3',1,'operator>(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444c5e1f7f62cf798066d5659366df23',1,'operator>(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab561641feed35c20278ece35bb8797b3',1,'operator>(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b861ce2de51abdd03593b3d3d84f684',1,'operator>(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53c1fd7fbe4e5985f1d2fa725731eb08',1,'operator>(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1a9e6afe8941f12362335b1a80e42496',1,'operator>(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9896d8eed5804f7d4900f8b8266295ba',1,'operator>(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ca64d102ed2cfae7f3abeb781421204',1,'operator>(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ac833608b2481b20d0d91a71036d45d',1,'operator>(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae2237c47c62d003ee6a19ff2b3cd54b2',1,'operator>(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga990332db3565090a646987254c79fab4',1,'operator>(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4e587facdf3b1a86a40be230639efef',1,'operator>(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67f6d1cb7b1b325a6dfe5414dbb94dbd',1,'operator>(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad98a98af64c25c869aae0f4ad0c55af4',1,'operator>(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1fd6dc47e174621164179fbf737f2809',1,'operator>(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadd34ffd2648022fee481fe264945565c',1,'operator>(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c9c2d7a26f8d9c7b8834f9f190a8914',1,'operator>(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga640d6afcfb462ced93eefa1b697cd060',1,'operator>(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa37cb32841f9ffa14b1936e05a1ebe9',1,'operator>(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga94e97195a2b7cecf5ede8e47d260723c',1,'operator>(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga335811f06efddba5e75ce0116d04783a',1,'operator>(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaa4f074c9ea9489fd8b41157998c5fed',1,'operator>(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f1e7ce1a6510265ead6b6207f39effc',1,'operator>(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9756cee47606a4de0ca1c3c8e97a40b2',1,'operator>(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d783278f798a238eb375b58e4eeade4',1,'operator>(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab439a8c37814ba930d4f4f0d15095883',1,'operator>(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafad508ec58830cc1077eb07e8fc153fd',1,'operator>(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga408471782e6c3338d5ee9de16e31644e',1,'operator>(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35415f4fd50ebd8a203fef079c54ec8d',1,'operator>(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14fe180ed1d9c9666c46e88a36c421a8',1,'operator>(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab45d33bf92b38f1331208282fda45064',1,'operator>(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1c384571fec644fe63911fd26bf6e6b',1,'operator>(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga31473d08b4bb642729365caf9a6c0e39',1,'operator>(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa100c0ecc7e8aec9341b40562ac55b3a',1,'operator>(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb98ebc2ade19b8e960fa40f5d6a253e',1,'operator>(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2eaa0d1ca6c4bb54774350171b9e16b5',1,'operator>(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6458afcdc07e562050e4315122f859d2',1,'operator>(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8d2cc8c1b0507e85f915853485ecc6d0',1,'operator>(double s, const double1 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a4888830ee6fb21e7bb62e14a2ab70ba2',1,'__gnu_cxx::operator>(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a15ea80c5370562c6713c383c5277c3c0',1,'__gnu_cxx::operator>(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a3137c36cfc4f7bc7580eb06bc8d2845c',1,'__gnu_cxx::operator>(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a886fc839debeebe4e1453774a028d1e3',1,'std::operator>(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6116f2ba6a75587900983e4a6662a528',1,'std::operator>(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga00de6fe7684f71fc08bad81b4bc65c52',1,'std::operator>(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afd4ebca607a5d77bce0ce62ed7c86fb9',1,'std::operator>(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a76a6b1542f3e854da212df3a9046cd05',1,'std::operator>(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaec6e1b27604a07cb7a1158c0a1da0810',1,'std::operator>(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga61879ec22c8f941d3bc5a6f57f094779',1,'std::operator>(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a14156f76400cead9187280c59587a8f1',1,'std::operator>(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20e59f399d0143cf0517ed705d5f095a',1,'std::operator>(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5554501d29b4f818450c37cbf8e3b403',1,'std::operator>(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga99794cccf99b31cbb9c80f20ff638cc0',1,'std::operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaaee0b4d314905566d4d083f1f3cabfa4',1,'std::operator>(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a1d46b9793f5a9a6d38267007fabb0e05',1,'std::operator>(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac70654ce03713da520f19dc5a9a87edc',1,'std::operator>(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1bdb78aca267183451bbd59a262f52c9',1,'std::operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a3a727df15fd08af612b872262e50a95f',1,'std::operator>(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a7788944c30c3070441dc376df8beb210',1,'std::operator>(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#af745511bf2598950056525a3fd7a346b',1,'std::operator>(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a56282963f192a45f81f55fa9c6a8005a',1,'std::operator>(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0f0b7503d67a8bd548778912aa40de84',1,'std::operator>(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ab05d57b2cc8854cbdb97bc0676abf2c0',1,'std::operator>(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a84b60842f88cb57f0075a964c68794b5',1,'std::__debug::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a8885d72d87c6b3b0441124b7e625b92d',1,'std::__profile::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#a05cd508a43f05f31e7fb298edd7a84e1',1,'std::rel_ops::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gabc26fba16414cb3d2c1247de4be61cfd',1,'std::tr2::operator>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gabc26fba16414cb3d2c1247de4be61cfd',1,'operator>(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaec6e1b27604a07cb7a1158c0a1da0810',1,'operator>(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga61879ec22c8f941d3bc5a6f57f094779',1,'operator>(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga20e59f399d0143cf0517ed705d5f095a',1,'operator>(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga5554501d29b4f818450c37cbf8e3b403',1,'operator>(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga99794cccf99b31cbb9c80f20ff638cc0',1,'operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaaee0b4d314905566d4d083f1f3cabfa4',1,'operator>(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1bdb78aca267183451bbd59a262f52c9',1,'operator>(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga00de6fe7684f71fc08bad81b4bc65c52',1,'operator>(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], + ['operator_3e_3d_124',['operator>=',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a39f3eecb2debd3e05e155d8769597994',1,'cv::MatExpr::operator>=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a908e8895c1daab24e5e8be7b9adddf12',1,'cv::MatExpr::operator>=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae5acab862f659f77658f59c723791d2d',1,'cv::MatExpr::operator>=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#afb86a86ce5bdb62722ad6a2c38eb2279',1,'cv::MatExpr::operator>=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac87dbdcc89fc97aff6e94ff635da8949',1,'cv::MatExpr::operator>=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a39f3eecb2debd3e05e155d8769597994',1,'cv::MatExpr::operator>=(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a908e8895c1daab24e5e8be7b9adddf12',1,'cv::MatExpr::operator>=(const Mat &a, double s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ae5acab862f659f77658f59c723791d2d',1,'cv::MatExpr::operator>=(double s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#afb86a86ce5bdb62722ad6a2c38eb2279',1,'cv::MatExpr::operator>=(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac87dbdcc89fc97aff6e94ff635da8949',1,'cv::MatExpr::operator>=(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga7523b2303cf5a3e9343147742f277149',1,'cv::softdouble::operator>=()'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3899c1c417984a878e1623a12f364a6b',1,'cv::softfloat::operator>=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga192e4da1bbd83aa64b5e2e86dba8f9e9',1,'cv::operator>=()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5330cc80f66e09053ad401da24bfe0',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55b886854f93ec539b81f73de542c40d',1,'cv::cudev::operator>=(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61c7293a315c1910a0d1c6bf5963a67f',1,'cv::cudev::operator>=(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1373cae04cbfcbed044238b4c0012f52',1,'cv::cudev::operator>=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66183c3c065c37807ae7a9aac89d9683',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b53ea181ce1eb43fe1ae329325e99e8',1,'cv::cudev::operator>=(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59dbec8b57764f129596bdbcdd1e3562',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga204eca640e93cedab25090194331d1e2',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d31376fae318ac2ab9434b0d4722af',1,'cv::cudev::operator>=(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad95a5e9db7d69228b51369c9c896b56a',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89fd435cb3c2b6f23d64a7f3b4819810',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb2b192959982b295e1f878e1566591',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc12a2670b0ad46ad9469d31eebddf1b',1,'cv::cudev::operator>=(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e8c18e6ea5465dcb4e5ac9943b2dfd5',1,'cv::cudev::operator>=(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43f457f9623ab455d55dd8f1d0327f71',1,'cv::cudev::operator>=(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5aecb08d3a88db58f50c4fb709b7933',1,'cv::cudev::operator>=(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb4d3916b4d585e3643669ec78803951',1,'cv::cudev::operator>=(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6029848613f09b4123c7938a88c53a',1,'cv::cudev::operator>=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0815757e177f6d5b7721244f12f6903',1,'cv::cudev::operator>=(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3fcf73436590c1ce9ad286097fe9cfc',1,'cv::cudev::operator>=(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f31eca1742f7f20d7e80cac55cbffe6',1,'cv::cudev::operator>=(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ed0450c5195379d076650cf1be91169',1,'cv::cudev::operator>=(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf4d4a962b7b8c6ca198d746416b5c3d',1,'cv::cudev::operator>=(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga477ddd386db964f74d70293d7687b0c8',1,'cv::cudev::operator>=(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7765769643c89f70c73d35ec4a3cadd',1,'cv::cudev::operator>=(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c680c140830f6d38dd143b428e2f4',1,'cv::cudev::operator>=(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf21a4fde0acb285c32c1d56008abcf41',1,'cv::cudev::operator>=(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3afa887b077a0f377b27f72350df7259',1,'cv::cudev::operator>=(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed44ab15e814fce58a672cdb92eaaaf0',1,'cv::cudev::operator>=(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8406f156d41ec17be418590d2e953a74',1,'cv::cudev::operator>=(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1f9c52c48f29114947a08f0984cc23',1,'cv::cudev::operator>=(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga539493c0b07035d7e67d87bd68856ca4',1,'cv::cudev::operator>=(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef31a3f97ef6709045c6c5e280dffef1',1,'cv::cudev::operator>=(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547d2e06b7c5d87d0392acfbbb350e3d',1,'cv::cudev::operator>=(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebe853d079262445e933d64c232dea87',1,'cv::cudev::operator>=(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b136da085c473eec683b0d25665d999',1,'cv::cudev::operator>=(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abf293a57acdb1d193efdbeb48850b7',1,'cv::cudev::operator>=(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc74e9748c7d824f4c402e7443157efd',1,'cv::cudev::operator>=(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4cfc621933360fd6c3a21434b90477a',1,'cv::cudev::operator>=(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade5ffb51464ed9a304c6ccf1eea95bff',1,'cv::cudev::operator>=(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba4b299c1f9f39e23300e9dda97f1a5',1,'cv::cudev::operator>=(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga588bf5d735442049d6513d94884fcd33',1,'cv::cudev::operator>=(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3c9bc60881121216c407af1a319ed6',1,'cv::cudev::operator>=(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6951e256e5788320f1eca5105f76596f',1,'cv::cudev::operator>=(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8694d45c659b1fee5f7806e99aac8e7',1,'cv::cudev::operator>=(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d6eedcf500e803f32a17150b27968a5',1,'cv::cudev::operator>=(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f344776a2bbd8f29184a166ef092af2',1,'cv::cudev::operator>=(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e41bcdfabc98e9ec2de85bc163826b5',1,'cv::cudev::operator>=(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f33674629adbf0b08b4fb78c25495cc',1,'cv::cudev::operator>=(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1dada72f050c77f7e18d2bf96c8e376',1,'cv::cudev::operator>=(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab363efde6df231138d5222b1b6bd48f3',1,'cv::cudev::operator>=(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb8f7ad533a2657bd11aabdcdd7ee987',1,'cv::cudev::operator>=(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a68b7438b043a42d8732d97012003f5',1,'cv::cudev::operator>=(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4154e5c15631b66c54787029ebc990c3',1,'cv::cudev::operator>=(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45a21bb3cd57a2e993037143309e84e1',1,'cv::cudev::operator>=(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dc323ca96973f3bb10ea8ff03296b78',1,'cv::cudev::operator>=(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08b0e1e9ffda58046cd9889f7068e649',1,'cv::cudev::operator>=(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4edddce6542f00b2cb1de230437ba40b',1,'cv::cudev::operator>=(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24927de1bc04bacffcbb04310862f2e',1,'cv::cudev::operator>=(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb3f698e36d064129d4414b2ad6a9a3e',1,'cv::cudev::operator>=(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ccf77a9b8d87c2980e3d2f435125264',1,'cv::cudev::operator>=(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga249d6a87d32bd5ad9f4e22f32ccd632a',1,'cv::cudev::operator>=(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b591de78c118edddff4887525e0c5d9',1,'cv::cudev::operator>=(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaac862fd70672e334a90773b88267455',1,'cv::cudev::operator>=(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga775f874d3cba778e3c0cae929b525fc8',1,'cv::cudev::operator>=(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4590cd1de2f1f07aa520e168ea968c27',1,'cv::cudev::operator>=(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e5b8010cca18aab7e53847d1133ce81',1,'cv::cudev::operator>=(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85ba6a29fe83842bfffc726e582b5ee3',1,'cv::cudev::operator>=(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e36f2665d9739cc06ae0cb2562e8c0',1,'cv::cudev::operator>=(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e320de3bce9ed33ff9c8fc57be6d39',1,'cv::cudev::operator>=(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad59ee5976df102e72b1ff749231c9f47',1,'cv::cudev::operator>=(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67126297a64ef25f2c3194020fca3cad',1,'cv::cudev::operator>=(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a68b5ab03282686225ed7b88012c4b',1,'cv::cudev::operator>=(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae68aad51dc7f176ef197ee8c43c3a41d',1,'cv::cudev::operator>=(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga474292d4a9c6579fc2d31c9dcdcaa971',1,'cv::cudev::operator>=(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee757427c34f7ec54713ef3daae854ef',1,'cv::cudev::operator>=(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73786eb58807a17a538c755e34d9675d',1,'cv::cudev::operator>=(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab24f6ed6cb8e1e447b97a75be6654f7f',1,'cv::cudev::operator>=(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae61d709025c856d3146d10cb7e788d75',1,'cv::cudev::operator>=(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga802b60c4cd50658153f7e88b252935c5',1,'cv::cudev::operator>=(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab681691fbf17f68b4e9d588645b08116',1,'cv::cudev::operator>=(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d8502df0ee39c8dbae6ae47d4806b8a',1,'cv::cudev::operator>=(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8ffbcfb9495f8eea8cde1af08039d6',1,'cv::cudev::operator>=(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcbec3693958703c755c64ce0937ba3',1,'cv::cudev::operator>=(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7768c8e69a236df27818762a8f104c35',1,'cv::cudev::operator>=(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6879e2b18878ecceaab7af951c8d02fc',1,'cv::cudev::operator>=(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacacfa7f605da556808ffabf98be76b0',1,'cv::cudev::operator>=(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa4b9df279731155760f059dbe663be7',1,'cv::cudev::operator>=(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga932feafc496906a1677f88fc87ea080b',1,'cv::cudev::operator>=(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0b5d7bde9d408e0589cd5f21072be91',1,'cv::cudev::operator>=(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053ac7b33a7fdc5d34218983001f0f43',1,'cv::cudev::operator>=(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c72029e1748eb9921b128c7e1306487',1,'cv::cudev::operator>=(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga646651e94a7b468f128be9c30a448e94',1,'cv::cudev::operator>=(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f6ccf218473b80b7b2dcc253febdc9a',1,'cv::cudev::operator>=(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9507310e4ad6cfcbca66c2fd7c7082f',1,'cv::cudev::operator>=(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b1151c7a2a2ddd85dcf62518c58d49',1,'cv::cudev::operator>=(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0edff402253aa4596b3dc6854b6af18e',1,'cv::cudev::operator>=(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1531b3d6906a273b4cf9e8c56e19caa',1,'cv::cudev::operator>=(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fbf32a1fa03bb675190ebd2adb3ac70',1,'cv::cudev::operator>=(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34384f5470f48a898cd982db515575c3',1,'cv::cudev::operator>=(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2b88160c219e0921cfea0acf8c246c5',1,'cv::cudev::operator>=(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga478501caf9d016ecb74e586aa74a8eff',1,'cv::cudev::operator>=(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga343064aec5bc2570785ee2e4b25f2190',1,'cv::cudev::operator>=(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2eab9bc4ae70aa428b0a54595b4d1b2',1,'cv::cudev::operator>=(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad08e83716e56a26fe1d0e187f0d119c0',1,'cv::cudev::operator>=(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4010de5c35fd52658f696ef5106f8d8b',1,'cv::cudev::operator>=(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6abb0e15698a012d2de983ded0ab3030',1,'cv::cudev::operator>=(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d8af3d392d78262551dea823f822220',1,'cv::cudev::operator>=(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2ed51d9bd9237ec4ee957a2861de80d7',1,'cv::cudev::operator>=(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae5341fc17764c044f28d7510fd879d',1,'cv::cudev::operator>=(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510b88a926bd78ed6550626a57f297f5',1,'cv::cudev::operator>=(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a824a0f0b67806b6db61f3532ec2c97',1,'cv::cudev::operator>=(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95c4a13893450c74268cecbb7a4d47a7',1,'cv::cudev::operator>=(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ddf2b8e66168e64e5baec6ce0e558e',1,'cv::cudev::operator>=(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e68f9ecf09b25e36f1530afba43747d',1,'cv::cudev::operator>=(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4827daed85d7647479290921fae85f9',1,'cv::cudev::operator>=(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga731e1a86a51c771a75d83daa958df9e0',1,'cv::cudev::operator>=(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1f457d5eb24579073db8c8c0dd3d1ad',1,'cv::cudev::operator>=(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8e092faec9f57baa41674711a444ea',1,'cv::cudev::operator>=(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga541f5919f746411f043d670afb3ba7b3',1,'cv::cudev::operator>=(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga3899c1c417984a878e1623a12f364a6b',1,'operator>=(const softfloat &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html#ga7523b2303cf5a3e9343147742f277149',1,'operator>=(const softdouble &) const(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga192e4da1bbd83aa64b5e2e86dba8f9e9',1,'operator>=(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a5330cc80f66e09053ad401da24bfe0',1,'operator>=(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga55b886854f93ec539b81f73de542c40d',1,'operator>=(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61c7293a315c1910a0d1c6bf5963a67f',1,'operator>=(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1373cae04cbfcbed044238b4c0012f52',1,'operator>=(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga66183c3c065c37807ae7a9aac89d9683',1,'operator>=(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b53ea181ce1eb43fe1ae329325e99e8',1,'operator>=(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga59dbec8b57764f129596bdbcdd1e3562',1,'operator>=(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga204eca640e93cedab25090194331d1e2',1,'operator>=(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga82d31376fae318ac2ab9434b0d4722af',1,'operator>=(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad95a5e9db7d69228b51369c9c896b56a',1,'operator>=(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89fd435cb3c2b6f23d64a7f3b4819810',1,'operator>=(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cb2b192959982b295e1f878e1566591',1,'operator>=(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc12a2670b0ad46ad9469d31eebddf1b',1,'operator>=(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6e8c18e6ea5465dcb4e5ac9943b2dfd5',1,'operator>=(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43f457f9623ab455d55dd8f1d0327f71',1,'operator>=(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa5aecb08d3a88db58f50c4fb709b7933',1,'operator>=(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb4d3916b4d585e3643669ec78803951',1,'operator>=(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9d6029848613f09b4123c7938a88c53a',1,'operator>=(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab0815757e177f6d5b7721244f12f6903',1,'operator>=(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3fcf73436590c1ce9ad286097fe9cfc',1,'operator>=(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f31eca1742f7f20d7e80cac55cbffe6',1,'operator>=(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ed0450c5195379d076650cf1be91169',1,'operator>=(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf4d4a962b7b8c6ca198d746416b5c3d',1,'operator>=(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga477ddd386db964f74d70293d7687b0c8',1,'operator>=(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7765769643c89f70c73d35ec4a3cadd',1,'operator>=(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0e1c680c140830f6d38dd143b428e2f4',1,'operator>=(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf21a4fde0acb285c32c1d56008abcf41',1,'operator>=(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3afa887b077a0f377b27f72350df7259',1,'operator>=(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed44ab15e814fce58a672cdb92eaaaf0',1,'operator>=(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8406f156d41ec17be418590d2e953a74',1,'operator>=(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1c1f9c52c48f29114947a08f0984cc23',1,'operator>=(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga539493c0b07035d7e67d87bd68856ca4',1,'operator>=(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef31a3f97ef6709045c6c5e280dffef1',1,'operator>=(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga547d2e06b7c5d87d0392acfbbb350e3d',1,'operator>=(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebe853d079262445e933d64c232dea87',1,'operator>=(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2b136da085c473eec683b0d25665d999',1,'operator>=(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5abf293a57acdb1d193efdbeb48850b7',1,'operator>=(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc74e9748c7d824f4c402e7443157efd',1,'operator>=(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4cfc621933360fd6c3a21434b90477a',1,'operator>=(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade5ffb51464ed9a304c6ccf1eea95bff',1,'operator>=(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba4b299c1f9f39e23300e9dda97f1a5',1,'operator>=(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga588bf5d735442049d6513d94884fcd33',1,'operator>=(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3c9bc60881121216c407af1a319ed6',1,'operator>=(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6951e256e5788320f1eca5105f76596f',1,'operator>=(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae8694d45c659b1fee5f7806e99aac8e7',1,'operator>=(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d6eedcf500e803f32a17150b27968a5',1,'operator>=(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9f344776a2bbd8f29184a166ef092af2',1,'operator>=(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e41bcdfabc98e9ec2de85bc163826b5',1,'operator>=(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f33674629adbf0b08b4fb78c25495cc',1,'operator>=(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab1dada72f050c77f7e18d2bf96c8e376',1,'operator>=(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab363efde6df231138d5222b1b6bd48f3',1,'operator>=(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb8f7ad533a2657bd11aabdcdd7ee987',1,'operator>=(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a68b7438b043a42d8732d97012003f5',1,'operator>=(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4154e5c15631b66c54787029ebc990c3',1,'operator>=(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga45a21bb3cd57a2e993037143309e84e1',1,'operator>=(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3dc323ca96973f3bb10ea8ff03296b78',1,'operator>=(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga08b0e1e9ffda58046cd9889f7068e649',1,'operator>=(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4edddce6542f00b2cb1de230437ba40b',1,'operator>=(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf24927de1bc04bacffcbb04310862f2e',1,'operator>=(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeb3f698e36d064129d4414b2ad6a9a3e',1,'operator>=(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ccf77a9b8d87c2980e3d2f435125264',1,'operator>=(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga249d6a87d32bd5ad9f4e22f32ccd632a',1,'operator>=(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b591de78c118edddff4887525e0c5d9',1,'operator>=(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaac862fd70672e334a90773b88267455',1,'operator>=(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga775f874d3cba778e3c0cae929b525fc8',1,'operator>=(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4590cd1de2f1f07aa520e168ea968c27',1,'operator>=(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4e5b8010cca18aab7e53847d1133ce81',1,'operator>=(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85ba6a29fe83842bfffc726e582b5ee3',1,'operator>=(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga88e36f2665d9739cc06ae0cb2562e8c0',1,'operator>=(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64e320de3bce9ed33ff9c8fc57be6d39',1,'operator>=(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad59ee5976df102e72b1ff749231c9f47',1,'operator>=(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67126297a64ef25f2c3194020fca3cad',1,'operator>=(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a68b5ab03282686225ed7b88012c4b',1,'operator>=(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae68aad51dc7f176ef197ee8c43c3a41d',1,'operator>=(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga474292d4a9c6579fc2d31c9dcdcaa971',1,'operator>=(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaee757427c34f7ec54713ef3daae854ef',1,'operator>=(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga73786eb58807a17a538c755e34d9675d',1,'operator>=(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab24f6ed6cb8e1e447b97a75be6654f7f',1,'operator>=(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae61d709025c856d3146d10cb7e788d75',1,'operator>=(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga802b60c4cd50658153f7e88b252935c5',1,'operator>=(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab681691fbf17f68b4e9d588645b08116',1,'operator>=(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1d8502df0ee39c8dbae6ae47d4806b8a',1,'operator>=(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8ffbcfb9495f8eea8cde1af08039d6',1,'operator>=(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9bcbec3693958703c755c64ce0937ba3',1,'operator>=(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7768c8e69a236df27818762a8f104c35',1,'operator>=(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6879e2b18878ecceaab7af951c8d02fc',1,'operator>=(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaacacfa7f605da556808ffabf98be76b0',1,'operator>=(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa4b9df279731155760f059dbe663be7',1,'operator>=(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga932feafc496906a1677f88fc87ea080b',1,'operator>=(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0b5d7bde9d408e0589cd5f21072be91',1,'operator>=(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga053ac7b33a7fdc5d34218983001f0f43',1,'operator>=(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c72029e1748eb9921b128c7e1306487',1,'operator>=(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga646651e94a7b468f128be9c30a448e94',1,'operator>=(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0f6ccf218473b80b7b2dcc253febdc9a',1,'operator>=(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab9507310e4ad6cfcbca66c2fd7c7082f',1,'operator>=(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20b1151c7a2a2ddd85dcf62518c58d49',1,'operator>=(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0edff402253aa4596b3dc6854b6af18e',1,'operator>=(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac1531b3d6906a273b4cf9e8c56e19caa',1,'operator>=(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fbf32a1fa03bb675190ebd2adb3ac70',1,'operator>=(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga34384f5470f48a898cd982db515575c3',1,'operator>=(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2b88160c219e0921cfea0acf8c246c5',1,'operator>=(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga478501caf9d016ecb74e586aa74a8eff',1,'operator>=(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga343064aec5bc2570785ee2e4b25f2190',1,'operator>=(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa2eab9bc4ae70aa428b0a54595b4d1b2',1,'operator>=(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad08e83716e56a26fe1d0e187f0d119c0',1,'operator>=(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4010de5c35fd52658f696ef5106f8d8b',1,'operator>=(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6abb0e15698a012d2de983ded0ab3030',1,'operator>=(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0d8af3d392d78262551dea823f822220',1,'operator>=(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2ed51d9bd9237ec4ee957a2861de80d7',1,'operator>=(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacae5341fc17764c044f28d7510fd879d',1,'operator>=(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga510b88a926bd78ed6550626a57f297f5',1,'operator>=(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0a824a0f0b67806b6db61f3532ec2c97',1,'operator>=(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95c4a13893450c74268cecbb7a4d47a7',1,'operator>=(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga11ddf2b8e66168e64e5baec6ce0e558e',1,'operator>=(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e68f9ecf09b25e36f1530afba43747d',1,'operator>=(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac4827daed85d7647479290921fae85f9',1,'operator>=(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga731e1a86a51c771a75d83daa958df9e0',1,'operator>=(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa1f457d5eb24579073db8c8c0dd3d1ad',1,'operator>=(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc8e092faec9f57baa41674711a444ea',1,'operator>=(const double2 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga541f5919f746411f043d670afb3ba7b3',1,'operator>=(double s, const double1 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a1ec2deb39f1b5127f5a8bb2b26450c03',1,'__gnu_cxx::operator>=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#a9fd2a7c53cf7d775379e0d6097658545',1,'__gnu_cxx::operator>=(const __versa_string< _CharT, _Traits, _Alloc, _Base > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01554.html#aa626858a9a44d7932ad8c38fb4905b34',1,'__gnu_cxx::operator>=(const _CharT *__lhs, const __versa_string< _CharT, _Traits, _Alloc, _Base > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a11bb9b3800196c309babae27f4b4a900',1,'std::operator>=(const stack< _Tp, _Seq > &__x, const stack< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ac65d320a052a5d4d1477ef25b5627be5',1,'std::operator>=(const queue< _Tp, _Seq > &__x, const queue< _Tp, _Seq > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga4abfa75dbeb7ee6922ab97aaaba57d47',1,'std::operator>=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acddc46a5f1205d53f5f682a89259c38e',1,'std::operator>=(const multiset< _Key, _Compare, _Alloc > &__x, const multiset< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abf5b635cc4dfc9f737e9a3933b6d7e06',1,'std::operator>=(const set< _Key, _Compare, _Alloc > &__x, const set< _Key, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga9ee66c57996b60af8514834ba5054af4',1,'std::operator>=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga81455a2af5c1721d3340fa06eaccfe06',1,'std::operator>=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a69dd44d827cf392b3490c7498d47cd5b',1,'std::operator>=(const multimap< _Key, _Tp, _Compare, _Alloc > &__x, const multimap< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa4a816fd640e88c0b2e9b0bb6cc4cb19',1,'std::operator>=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga86523db2bbd873f4bc26c42a77f443b3',1,'std::operator>=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1225fba40c8af2c834e8201af601829b',1,'std::operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga71a6363d6cad986521d5f5a1537a1e06',1,'std::operator>=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8bd7da47a9941d7e825411420feb6ac1',1,'std::operator>=(const forward_list< _Tp, _Alloc > &__lx, const forward_list< _Tp, _Alloc > &__ly)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a03f03b3697da916e95a09b1488df52df',1,'std::operator>=(const map< _Key, _Tp, _Compare, _Alloc > &__x, const map< _Key, _Tp, _Compare, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fdb938850a723e8e447fce21fc0b7c2',1,'std::operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a9a32938be630f180eddc69f0402d13ca',1,'std::operator>=(const vector< _Tp, _Alloc > &__x, const vector< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a628eda81f6cb2988d8f5908f631cdb46',1,'std::operator>=(const list< _Tp, _Alloc > &__x, const list< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a5e3f58e54e9cbbcda75328fada9fa1a5',1,'std::operator>=(const deque< _Tp, _Alloc > &__x, const deque< _Tp, _Alloc > &__y)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a4fd05c4c42075e6787d13b7dd454ba77',1,'std::operator>=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a56fe512b61535754991c71651054a4a3',1,'std::operator>=(const basic_string< _CharT, _Traits, _Alloc > &__lhs, const _CharT *__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad9ef507927a631a73f69c9d4d8add693',1,'std::operator>=(const _CharT *__lhs, const basic_string< _CharT, _Traits, _Alloc > &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01577.html#a636d8ef229361158ab4945c00d7676be',1,'std::__debug::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01579.html#a73aff27c428faa615874629ae0250e64',1,'std::__profile::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01575.html#ac93a7559412662f6dfd7c206ecb98f99',1,'std::rel_ops::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga08b65275697884e0facdf36f73c0bb7d',1,'std::tr2::operator>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga08b65275697884e0facdf36f73c0bb7d',1,'operator>=(const dynamic_bitset< _WordT, _Alloc > &__lhs, const dynamic_bitset< _WordT, _Alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga9ee66c57996b60af8514834ba5054af4',1,'operator>=(const sub_match< _BiIter > &__lhs, const sub_match< _BiIter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga81455a2af5c1721d3340fa06eaccfe06',1,'operator>=(const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#gaa4a816fd640e88c0b2e9b0bb6cc4cb19',1,'operator>=(const sub_match< _Bi_iter > &__lhs, const __sub_match_string< _Bi_iter, _Ch_traits, _Ch_alloc > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga86523db2bbd873f4bc26c42a77f443b3',1,'operator>=(typename iterator_traits< _Bi_iter >::value_type const *__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga1225fba40c8af2c834e8201af601829b',1,'operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const *__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga71a6363d6cad986521d5f5a1537a1e06',1,'operator>=(typename iterator_traits< _Bi_iter >::value_type const &__lhs, const sub_match< _Bi_iter > &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html#ga4fdb938850a723e8e447fce21fc0b7c2',1,'operator>=(const sub_match< _Bi_iter > &__lhs, typename iterator_traits< _Bi_iter >::value_type const &__rhs)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html#ga4abfa75dbeb7ee6922ab97aaaba57d47',1,'operator>=(const pair< _T1, _T2 > &__x, const pair< _T1, _T2 > &__y)(Global Namespace)']]], + ['operator_3e_3e_125',['operator>>',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aeff689aa3f1d9e49c24e22b097d17b04',1,'cv::FileNode::operator>>(const FileNode &n, _Tp &value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a4e6bc57b90b1336bc5fdaa055c5295cc',1,'cv::FileNode::operator>>(const FileNode &n, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a002a7403a3c77de6fdb3e080cf4657db',1,'cv::FileNode::operator>>(const FileNode &n, KeyPoint &kpt)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9137a05efd7738001795800234e73eef',1,'cv::FileNode::operator>>(const FileNode &n, DMatch &m)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#aeff689aa3f1d9e49c24e22b097d17b04',1,'cv::FileNode::operator>>(const FileNode &n, _Tp &value)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a4e6bc57b90b1336bc5fdaa055c5295cc',1,'cv::FileNode::operator>>(const FileNode &n, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a002a7403a3c77de6fdb3e080cf4657db',1,'cv::FileNode::operator>>(const FileNode &n, KeyPoint &kpt)'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a9137a05efd7738001795800234e73eef',1,'cv::FileNode::operator>>(const FileNode &n, DMatch &m)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a0e9987928ef46a3fe99b3fe02b659dd4',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, _Tp &value)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a1b91e417a7103145b4997e086aec99df',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a0e9987928ef46a3fe99b3fe02b659dd4',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, _Tp &value)'],['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a1b91e417a7103145b4997e086aec99df',1,'cv::FileNodeIterator::operator>>(FileNodeIterator &it, std::vector< _Tp > &vec)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a199844fb74226a28b3ce3a39d1ff6765',1,'cv::VideoCapture::operator>>(Mat &image)'],['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#a35eb427f16b4ea5c502922aba9da835c',1,'cv::VideoCapture::operator>>(UMat &image)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'basic_iostream< char >::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'basic_iostream< char >::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_iostream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_iostream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_iostream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_iostream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_iostream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_iostream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_iostream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_iostream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_iostream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_iostream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_iostream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_iostream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_iostream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_iostream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_iostream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_iostream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_iostream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_iostream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_iostream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_iostream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_iostream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_iostream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_iostream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_iostream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_iostream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_iostream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_iostream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_iostream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_iostream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_iostream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'basic_istream< char >::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'basic_istream< char >::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'basic_istream< char, _Traits >::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'basic_istream< char, _Traits >::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char, _Traits >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char, _Traits >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char, _Traits >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char, _Traits >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char, _Traits >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char, _Traits >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char, _Traits >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char, _Traits >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char, _Traits >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char, _Traits >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char, _Traits >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char, _Traits >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char, _Traits >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char, _Traits >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char, _Traits >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'basic_istream< char, _Traits >::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'basic_istream< char, _Traits >::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'basic_istream< char, _Traits >::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'basic_istream< char, _Traits >::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'basic_istream< char, _Traits >::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'basic_istream< char, _Traits >::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'basic_istream< char, _Traits >::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'basic_istream< char, _Traits >::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'basic_istream< char, _Traits >::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'basic_istream< char, _Traits >::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'basic_istream< char, _Traits >::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'basic_istream< char, _Traits >::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'basic_istream< char, _Traits >::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'basic_istream< char, _Traits >::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'basic_istream< char, _Traits >::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_fstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_fstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_fstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_fstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_fstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_fstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_fstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_fstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_fstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_fstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_fstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_fstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_fstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_fstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_fstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_fstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_fstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_fstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_fstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_fstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_fstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_fstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_fstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_fstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_fstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_fstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_fstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_fstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_fstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_fstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_fstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_fstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_ifstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_ifstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_ifstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_ifstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_ifstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_ifstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_ifstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_ifstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_ifstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_ifstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_ifstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_ifstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_ifstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_ifstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_ifstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_ifstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_ifstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_ifstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_ifstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_ifstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_ifstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_ifstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_ifstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_ifstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_ifstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_ifstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_ifstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_ifstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_ifstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_ifstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_ifstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_ifstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_iostream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_iostream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_iostream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_iostream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_iostream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_iostream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_iostream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_iostream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_iostream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_iostream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_iostream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_iostream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_iostream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_iostream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_iostream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_iostream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_iostream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_iostream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_iostream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_iostream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_iostream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_iostream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_iostream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_iostream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_iostream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_iostream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_iostream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_iostream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_iostream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_iostream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_iostream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_iostream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_istream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_istream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_istringstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_istringstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_istringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_istringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_istringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_istringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_istringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_istringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_istringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_istringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_istringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_istringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_istringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_istringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_istringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_istringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_istringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#adeaf1064509afa95a3eb1b49c2d351e1',1,'std::basic_stringstream::operator>>(void *&__p)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a3e27102f9fe4c77782e581f359a6a118',1,'std::basic_stringstream::operator>>(__streambuf_type *__sb)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_stringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_stringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_stringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_stringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_stringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_stringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_stringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_stringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_stringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_stringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_stringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_stringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_stringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_stringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_stringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbcef374ef55284de359fe5b920c20c3',1,'std::basic_stringstream::operator>>(__istream_type &(*__pf)(__istream_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a84505fa4c5752e1143bb1458b3a23e6a',1,'std::basic_stringstream::operator>>(__ios_type &(*__pf)(__ios_type &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aed375bddc8064e0d86b920c2a0dac2a0',1,'std::basic_stringstream::operator>>(ios_base &(*__pf)(ios_base &))'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#ae323c8017fbcd54117924b4789569b5a',1,'std::basic_stringstream::operator>>(bool &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#af542ed27230ea0bbc6960a0f9556004f',1,'std::basic_stringstream::operator>>(short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#affcef40a87f4c392930dd81dfda3798f',1,'std::basic_stringstream::operator>>(unsigned short &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4c595f9f70643cfe25b5abeb862c8443',1,'std::basic_stringstream::operator>>(int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aba91dd572021d240f2385b2eb0c73a07',1,'std::basic_stringstream::operator>>(unsigned int &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a4a94cc0cfdd17d93c58228b5141904a6',1,'std::basic_stringstream::operator>>(long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a6a9a2eb43ef2fe89646033454347aa19',1,'std::basic_stringstream::operator>>(unsigned long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a78af82a5a9196d27ddee3be0d99354c6',1,'std::basic_stringstream::operator>>(long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a884f57a96ba4bda2be39e30ec516793a',1,'std::basic_stringstream::operator>>(unsigned long long &__n)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#aadf4b5059f8e6a0d601ab5c2fb8bc150',1,'std::basic_stringstream::operator>>(float &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#afbeb775011b09fa4f51d18dc84ffe497',1,'std::basic_stringstream::operator>>(double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02455.html#a2b4d9b107c966dc9ed975ba9cc157783',1,'std::basic_stringstream::operator>>(long double &__f)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aeba729a09e2f6c19b000476fa7eb0fcd',1,'std::bitset::operator>>(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aeba729a09e2f6c19b000476fa7eb0fcd',1,'std::bitset::operator>>(size_t __position) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae9a03a35d703cdbbf1155330a59eed57',1,'std::tr2::dynamic_bitset::operator>>(size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ae9a03a35d703cdbbf1155330a59eed57',1,'std::tr2::dynamic_bitset::operator>>(size_type __pos) const'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaae9733cc2b353835e1a8723dcfc171e2',1,'cv::operator>>()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a685b4cdb4af2a8d7a68fbfcd8e2548',1,'cv::cudev::operator>>(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga837d4419807a80ee32b3c961913cb7e4',1,'cv::cudev::operator>>(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefe26fd801b0820623044113109b13ec',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490716b718d4dd43c89d51694861843b',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5290b7ec0ee646136f388beb08e115f8',1,'cv::cudev::operator>>(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2d998b1143eae5f5d4f6cfebdfb00df',1,'cv::cudev::operator>>(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9af265df70ba6c6606a9384e989ae155',1,'cv::cudev::operator>>(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23a3e1f1df0cc826fa1e31152ef3c721',1,'cv::cudev::operator>>(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f3301b8bc25bdd2cb00ee98a81030b4',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c5c20ba9fe5527ded3ff0fd72f53cbf',1,'cv::cudev::operator>>(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05f308ef809ecd39ef9985554956d16a',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad327490c86961a8f0a65abc413fa546f',1,'cv::cudev::operator>>(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b60617070fde498fd3217af505e0c1',1,'cv::cudev::operator>>(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147aab19cdedc271193e916d905e7caf',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056be68e684c65e2836b5ef1b8089d3f',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac382672463e961bd8ab509e436b94494',1,'cv::cudev::operator>>(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa742399be625c93c587e8c358d0885cc',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga659b874a5439f4483fc9c1a7f6ea5d1f',1,'cv::cudev::operator>>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa23bb682b46b78eef7c4c6febadd786c',1,'cv::cudev::operator>>(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3fe97f46e29307fc51714496a0de0e3',1,'cv::cudev::operator>>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70f05e9528501005e278d9767f670818',1,'cv::cudev::operator>>(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e10e34970a384ffc99c5a56d78098bb',1,'cv::cudev::operator>>(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga036cb20b4c06864975ca4df3a6a7e1c3',1,'cv::cudev::operator>>(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dfe8d94a8059fea9c67a71fe1654cbf',1,'cv::cudev::operator>>(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaae9733cc2b353835e1a8723dcfc171e2',1,'operator>>(const v_reg< _Tp, n > &a, int imm)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a685b4cdb4af2a8d7a68fbfcd8e2548',1,'operator>>(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga837d4419807a80ee32b3c961913cb7e4',1,'operator>>(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaefe26fd801b0820623044113109b13ec',1,'operator>>(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga490716b718d4dd43c89d51694861843b',1,'operator>>(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5290b7ec0ee646136f388beb08e115f8',1,'operator>>(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf2d998b1143eae5f5d4f6cfebdfb00df',1,'operator>>(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9af265df70ba6c6606a9384e989ae155',1,'operator>>(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23a3e1f1df0cc826fa1e31152ef3c721',1,'operator>>(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f3301b8bc25bdd2cb00ee98a81030b4',1,'operator>>(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9c5c20ba9fe5527ded3ff0fd72f53cbf',1,'operator>>(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05f308ef809ecd39ef9985554956d16a',1,'operator>>(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad327490c86961a8f0a65abc413fa546f',1,'operator>>(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga87b60617070fde498fd3217af505e0c1',1,'operator>>(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147aab19cdedc271193e916d905e7caf',1,'operator>>(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056be68e684c65e2836b5ef1b8089d3f',1,'operator>>(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac382672463e961bd8ab509e436b94494',1,'operator>>(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa742399be625c93c587e8c358d0885cc',1,'operator>>(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga659b874a5439f4483fc9c1a7f6ea5d1f',1,'operator>>(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa23bb682b46b78eef7c4c6febadd786c',1,'operator>>(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3fe97f46e29307fc51714496a0de0e3',1,'operator>>(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga70f05e9528501005e278d9767f670818',1,'operator>>(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9e10e34970a384ffc99c5a56d78098bb',1,'operator>>(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga036cb20b4c06864975ca4df3a6a7e1c3',1,'operator>>(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1dfe8d94a8059fea9c67a71fe1654cbf',1,'operator>>(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf81c75e50c9ee8a791d90329d2fc7ef8',1,'std::operator>>(basic_istream< _CharT, _Traits > &__is, complex< _Tp > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#acda683e8b3ae5f1dd425bb99774304a7',1,'std::operator>>(_Istream &&__is, _Tp &&__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gab49649ed7cc5cb819ce52620f227b1a7',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_int_distribution< _IntType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gafb5c87acd910ec70edaedef33cf32aee',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_real_distribution< _RealType > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a113f151882a47755a4b297813977bbdc',1,'std::operator>>(basic_istream< _CharT, _Traits > &__is, __gnu_cxx::__versa_string< _CharT, _Traits, _Alloc, _Base > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga63a43b47a5315c8b1b55002af2eb1669',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::cauchy_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga2a24c2f5da07f3a713e036875355ad57',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::bernoulli_distribution &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga30ec0007b5169ab3c6847033db603493',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::geometric_distribution< _IntType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5dbbb1871bc0160e0b9cf609e222fb18',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::exponential_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gae0fa60823d48bfd5b1d7a7c0063826ba',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::weibull_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga391e8f9fb533a5fb81f4099e9b03ff6a',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, std::extreme_value_distribution< _RealType > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a6447193cb914c78fb13064c210e26ed8',1,'std::operator>>(basic_istream< _CharT, _Traits > &__is, basic_string< _CharT, _Traits, _Alloc > &__str)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a01cd5810d682dec840eee4ed6d2170d4',1,'std::operator>>(std::basic_istream< _CharT, _Traits > &__is, bitset< _Nb > &__x)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a8f6ffa961cd02381c76b3d3345641f4d',1,'std::operator>>(basic_istream< _CharT, _Traits > &__in, _CharT &__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#ad29bf992665f01e4a3623420b87f40d3',1,'std::operator>>(basic_istream< char, _Traits > &__in, unsigned char &__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a257b6c1fab9276d9a9ca63c29279d48c',1,'std::operator>>(basic_istream< char, _Traits > &__in, signed char &__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#afd645e31e415b300d870dba3de0af813',1,'std::operator>>(basic_istream< _CharT, _Traits > &__in, _CharT *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a40a0021a5cf39a79c2ff66d3c31ae277',1,'std::operator>>(basic_istream< char > &__in, char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aefcf45965f6bebc6083ba4d0207cca1d',1,'std::operator>>(basic_istream< char, _Traits > &__in, unsigned char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#abcee0d0bbe61b8a00e0336411d295f79',1,'std::operator>>(basic_istream< char, _Traits > &__in, signed char *__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01549.html#a9dc7b861adff63cefa05b539068f727e',1,'std::__detail::operator>>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga4618b05732d8eec5161f28b23c23227d',1,'std::tr2::operator>>()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga2a24c2f5da07f3a713e036875355ad57',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::bernoulli_distribution &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html#ga30ec0007b5169ab3c6847033db603493',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::geometric_distribution< _IntType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01476.html#gaf81c75e50c9ee8a791d90329d2fc7ef8',1,'operator>>(basic_istream< _CharT, _Traits > &__is, complex< _Tp > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga4618b05732d8eec5161f28b23c23227d',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, dynamic_bitset< _WordT, _Alloc > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html#ga63a43b47a5315c8b1b55002af2eb1669',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::cauchy_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga5dbbb1871bc0160e0b9cf609e222fb18',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::exponential_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#gae0fa60823d48bfd5b1d7a7c0063826ba',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::weibull_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html#ga391e8f9fb533a5fb81f4099e9b03ff6a',1,'operator>>(std::basic_istream< _CharT, _Traits > &__is, std::extreme_value_distribution< _RealType > &__x)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gab49649ed7cc5cb819ce52620f227b1a7',1,'operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_int_distribution< _IntType > &)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html#gafb5c87acd910ec70edaedef33cf32aee',1,'operator>>(std::basic_istream< _CharT, _Traits > &, std::uniform_real_distribution< _RealType > &)(Global Namespace)']]], + ['operator_3e_3e_3d_126',['operator>>=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac07ef85ee38aa3428883eb50f719cbca',1,'std::bitset::operator>>=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#ac07ef85ee38aa3428883eb50f719cbca',1,'std::bitset::operator>>=(size_t __position) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8293a4feaf1bde96e155e6ba528d0b9a',1,'std::gslice_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga611bd59fab7a43ce79f1707eea03be7a',1,'std::indirect_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga87f02d439b80dd0d351ae9f827c4f77e',1,'std::mask_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7ebc66086e23f1d4bb5cc554fedde16b',1,'std::slice_array::operator>>=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab0acb45e7697ddaa619582139a55227e',1,'std::tr2::dynamic_bitset::operator>>=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#ab0acb45e7697ddaa619582139a55227e',1,'std::tr2::dynamic_bitset::operator>>=(size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5ce6f32c286043434e864d28271f2069',1,'std::valarray::operator>>=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7f2a41abd2f316f4de7942652da2410d',1,'std::valarray::operator>>=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5ce6f32c286043434e864d28271f2069',1,'valarray< size_t >::operator>>=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga7f2a41abd2f316f4de7942652da2410d',1,'valarray< size_t >::operator>>=(const valarray< size_t > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8293a4feaf1bde96e155e6ba528d0b9a',1,'operator>>=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5ce6f32c286043434e864d28271f2069',1,'operator>>=(const _Tp &)(Global Namespace)']]], + ['operator_5b_5d_127',['operator[]',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a544bdab727d3b76828c915b0fe30a8e6',1,'cv::FileNode::operator[](const String &nodename) const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a611004b953e5a13140f2d344ed4f6398',1,'cv::FileNode::operator[](const char *nodename) const'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a031b7f492abe0f414a7627272bd6e467',1,'cv::FileNode::operator[](int i) const'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#adc7eff268ab95c664657a03e72ed85a5',1,'cv::FileStorage::operator[](const String &nodename) const'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#a532f6a27dd57d0f640c6a5a9acddac88',1,'cv::FileStorage::operator[](const char *nodename) const'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#ac04a07edf33eaef0dce8a2c7d5d193b2',1,'cv::cudev::GpuMat_::operator[](int y)'],['https://docs.opencv.org/4.2.0/d3/d1c/classcv_1_1cudev_1_1GpuMat__.html#a1caf23a850242f18af5cab4478b127b5',1,'cv::cudev::GpuMat_::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'cv::Mat_::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'cv::Mat_::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< double >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< double >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< float >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< float >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< uchar >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< uchar >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a40eef4cc4d9830358371af08935a5aa5',1,'Mat_< unsigned char >::operator[](int y)'],['https://docs.opencv.org/4.2.0/df/dfc/classcv_1_1Mat__.html#a6425fecc13cebeabc1472bf1f565a1bb',1,'Mat_< unsigned char >::operator[](int y) const'],['https://docs.opencv.org/4.2.0/d7/dcf/classcv_1_1MatConstIterator.html#aaf943dc53b7d402993ccc1f44412b594',1,'cv::MatConstIterator::operator[]()'],['https://docs.opencv.org/4.2.0/d1/de0/classcv_1_1MatConstIterator__.html#ad9682e4ade6a6f2b83d85b30d94b978f',1,'cv::MatConstIterator_::operator[]()'],['https://docs.opencv.org/4.2.0/d4/dfe/classcv_1_1MatIterator__.html#ab96bf874711db314307ac6a711666e85',1,'cv::MatIterator_::operator[]()'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#aa43c8afeb7e798ea5f1d585d1d3eab93',1,'cv::MatSize::operator[](int i) const'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a8a0c5d3f786fae008a10a6e3bc962215',1,'cv::MatSize::operator[](int i)'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#ae1261117212294e7dbd88c57dc4eb655',1,'cv::MatStep::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a8a4d7e49dff4d9c705e4840a5af56f70',1,'cv::MatStep::operator[](int i)'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#afc4d1e3df056b5fed3c76f0a03a212d4',1,'cv::gapi::own::Scalar::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d8/d72/classcv_1_1gapi_1_1own_1_1Scalar.html#aa3d769161bbbcb027050c7e17ff1cade',1,'cv::gapi::own::Scalar::operator[](int i)'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#a24367c518aca63c85976897fedd3153a',1,'cv::tbm::Track::operator[](size_t i) const'],['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#aa202964fa465e9edc7833c848866530c',1,'cv::tbm::Track::operator[](size_t i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'cv::Vec::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'cv::Vec::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< _Tp, 4 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< _Tp, 4 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, 2 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, 2 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, 3 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, 3 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, 4 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, 4 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, GPCPatchDescriptor::nFeatures >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< double, nFeatures >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< double, nFeatures >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< float, 2 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< float, 2 >::operator[](int i)'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#acb3c02f474eec3f1c36a90565895396a',1,'Vec< float, 3 >::operator[](int i) const'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#ac65f71f08e6af6e807ba4ca47ffd0d90',1,'Vec< float, 3 >::operator[](int i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#ab2b57e74d31d0fc2340d2cece8700b4a',1,'__gnu_cxx::__versa_string::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a9b58791d4ef7809989f8eaf599f980f1',1,'__gnu_cxx::__versa_string::operator[](size_type __pos) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< _CharT >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< _CharT >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< _CharT, _Traits, _Allocator >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< _CharT, _Traits, _Allocator >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< char >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< char >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< char, char_traits< char >, _Byte_alloc >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< char_type, _Traits, _Alloc >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< char_type, _Traits, _Alloc >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'basic_string< value_type >::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'basic_string< value_type >::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a461a433ad999e2d22e10f45addf1bb67',1,'deque< _StateSeqT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a513a4ab26ac9df40d7ec95fc50e1218b',1,'deque< _StateSeqT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6021c27572ef3bc03cea38c66dde3783',1,'match_results< _Bi_iter >::operator[](size_type __sub) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'match_results< _Bi_iter >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'match_results< _Bi_iter >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6021c27572ef3bc03cea38c66dde3783',1,'match_results< _Bi_iter >::operator[](size_type __sub) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#aac009c5b9a838a7e0651bd62047d6c5f',1,'std::basic_string::operator[](size_type __pos) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ae727161635dca3a36d696c73d391424b',1,'std::basic_string::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a03ad7ade15b93f22b17648d53ba20062',1,'std::bitset::operator[](size_t __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#afa6b9908b9752384b42da517a3ae3d8c',1,'std::bitset::operator[](size_t __position) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a03ad7ade15b93f22b17648d53ba20062',1,'std::bitset::operator[](size_t __position)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#afa6b9908b9752384b42da517a3ae3d8c',1,'std::bitset::operator[](size_t __position) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a461a433ad999e2d22e10f45addf1bb67',1,'std::deque::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07339.html#a513a4ab26ac9df40d7ec95fc50e1218b',1,'std::deque::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07763.html#a4a4a9f95131baf0713596d672ec36b5f',1,'std::map::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'std::match_results::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'std::match_results::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06751.html#a6021c27572ef3bc03cea38c66dde3783',1,'std::match_results::operator[](size_type __sub) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07651.html#a4dadeeb9101dbd3d257043519e6e35f8',1,'std::reverse_iterator::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a7b05f8159b467622dc2804f276ecc8ea',1,'std::tr2::dynamic_bitset::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a78022be7125e50468596e2a0e0df4a3b',1,'std::tr2::dynamic_bitset::operator[](size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a7b05f8159b467622dc2804f276ecc8ea',1,'std::tr2::dynamic_bitset::operator[](size_type __pos)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a78022be7125e50468596e2a0e0df4a3b',1,'std::tr2::dynamic_bitset::operator[](size_type __pos) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08019.html#a6fb7ee5ca798c98fa24524f0df6edd59',1,'std::unique_ptr< _Tp[], _Dp >::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'std::unordered_map::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'std::unordered_map::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'std::unordered_map::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'std::unordered_map::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2325176078e58966124ec919df2b1eb4',1,'std::valarray::operator[](size_t __i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e86bbdb258433295ab39596449a5f7e',1,'std::valarray::operator[](slice __s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad5394a15e9c7edd4ecece4534d3c3ba3',1,'std::valarray::operator[](slice __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga28ef76e86bd06a99b58af17899554590',1,'std::valarray::operator[](const gslice &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gae5e23cc8dbbeee72c16868aad85731ba',1,'std::valarray::operator[](const gslice &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f454eb267fee574dadea61b69b94d31',1,'std::valarray::operator[](const valarray< bool > &__m) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga24fb191ad805190686652a3a8bf7169b',1,'std::valarray::operator[](const valarray< bool > &__m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2d1a225784345f3c5eb3e94e984e5e00',1,'std::valarray::operator[](const valarray< size_t > &__i) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafcd1719464554185069224f2fd837de3',1,'std::valarray::operator[](const valarray< size_t > &__i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'std::vector::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'std::vector::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a2d7a21a98b09239b8745900308e63643',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](const key_type &__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a08047.html#a21d659d8a7b18d41726d04ed6451d1ce',1,'unordered_map< _Key, _Tp, _Hash, _Pred >::operator[](key_type &&__k)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2325176078e58966124ec919df2b1eb4',1,'valarray< size_t >::operator[](size_t __i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e86bbdb258433295ab39596449a5f7e',1,'valarray< size_t >::operator[](slice __s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gad5394a15e9c7edd4ecece4534d3c3ba3',1,'valarray< size_t >::operator[](slice __s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga28ef76e86bd06a99b58af17899554590',1,'valarray< size_t >::operator[](const gslice &__s) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gae5e23cc8dbbeee72c16868aad85731ba',1,'valarray< size_t >::operator[](const gslice &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f454eb267fee574dadea61b69b94d31',1,'valarray< size_t >::operator[](const valarray< bool > &__m) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga24fb191ad805190686652a3a8bf7169b',1,'valarray< size_t >::operator[](const valarray< bool > &__m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2d1a225784345f3c5eb3e94e984e5e00',1,'valarray< size_t >::operator[](const valarray< size_t > &__i) const'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gafcd1719464554185069224f2fd837de3',1,'valarray< size_t >::operator[](const valarray< size_t > &__i)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< __diff_type >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< __diff_type >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< __gnu_parallel::_Piece< _DifferenceType > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _CharClassT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _CharClassT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _CharT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _CharT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _Cmpt >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _Cmpt >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _Node *, _Nodeptr_Alloc >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _Node *, _Nodeptr_Alloc >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _RealType >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _RealType >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _State< _TraitsT::char_type > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _State< _TraitsT::char_type > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< _StringT >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< _StringT >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< block_type, allocator_type >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< block_type, allocator_type >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< Catalog_info * >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< Catalog_info * >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< double >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< double >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< int >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< int >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< result_type >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< result_type >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< size_t >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< size_t >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< std::pair< _BiIter, int > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< std::pair< _BiIter, int > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< std::pair< _StateIdT, std::vector > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< std::pair< _StateIdT, std::vector > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< std::pair< _StrTransT, _StrTransT > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< sub_match< _Bi_iter >, _Alloc >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< sub_match< _Bi_iter >, allocator< sub_match< _Bi_iter > > >::operator[](size_type __n) const noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#afdb93693c1129f8f23406e8a9f4dc27e',1,'vector< sub_match< _BiIter >, _Alloc >::operator[](size_type __n) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07967.html#a75bd59d9586be7f6d3e43e1afeac3d08',1,'vector< sub_match< _BiIter >, _Alloc >::operator[](size_type __n) const noexcept'],['https://eigen.tuxfamily.org/dox/classEigen_1_1ArithmeticSequence.html#a890959dd45db1bbee103c1861c53ffad',1,'Eigen::ArithmeticSequence::operator[]()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a496672306836589fa04a6ab33cb0cf2a',1,'Eigen::DenseCoeffsBase< Derived, ReadOnlyAccessors >::operator[]()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01WriteAccessors_01_4.html#aa2040f14e60fed1a4a68ca7f042e1bbf',1,'Eigen::DenseCoeffsBase< Derived, WriteAccessors >::operator[]()'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a9ea67fc1ef0ccc42e1d5388fe0416ae5.html#a9ea67fc1ef0ccc42e1d5388fe0416ae5',1,'nlohmann::basic_json::operator[](size_type idx)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_ad21d96f490fa1aa8605fba8dadcce319.html#ad21d96f490fa1aa8605fba8dadcce319',1,'nlohmann::basic_json::operator[](size_type idx) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a3f45f3820c456ad2e3f3df2926564151.html#a3f45f3820c456ad2e3f3df2926564151',1,'nlohmann::basic_json::operator[](const typename object_t::key_type &key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_acb5b489310f4e0ce2d5fb29b73fb59d3.html#acb5b489310f4e0ce2d5fb29b73fb59d3',1,'nlohmann::basic_json::operator[](const typename object_t::key_type &key) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_abc94831476f7b4d3efe6f2e9036c7188.html#abc94831476f7b4d3efe6f2e9036c7188',1,'nlohmann::basic_json::operator[](T *key)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a11bbe874496eb7b29a5549e0637de59e.html#a11bbe874496eb7b29a5549e0637de59e',1,'nlohmann::basic_json::operator[](T *key) const'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0d3deaa73b3644b4da3f8ef3172cd8d2.html#a0d3deaa73b3644b4da3f8ef3172cd8d2',1,'nlohmann::basic_json::operator[](const json_pointer &ptr)'],['https://nlohmann.github.io/json/doxygen/classnlohmann_1_1basic__json_a0a691c29eb7c4acd91ccb498a79cd3ee.html#a0a691c29eb7c4acd91ccb498a79cd3ee',1,'nlohmann::basic_json::operator[](const json_pointer &ptr) const'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_ae7a1ca8c1e234837d137471f73ae6012.html#ae7a1ca8c1e234837d137471f73ae6012',1,'nlohmann::ordered_map::operator[](const Key &key)'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a676082659d575e29bdb312bcde53023a.html#a676082659d575e29bdb312bcde53023a',1,'nlohmann::ordered_map::operator[](const Key &key) const'],['../classAR_1_1MarkerSet.html#abb1041eb9fc43bb7919406f08de27784',1,'AR::MarkerSet::operator[]()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2325176078e58966124ec919df2b1eb4',1,'operator[](size_t __i)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga5e86bbdb258433295ab39596449a5f7e',1,'operator[](slice __s) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga28ef76e86bd06a99b58af17899554590',1,'operator[](const gslice &__s) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga8f454eb267fee574dadea61b69b94d31',1,'operator[](const valarray< bool > &__m) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2d1a225784345f3c5eb3e94e984e5e00',1,'operator[](const valarray< size_t > &__i) const(Global Namespace)']]], + ['operator_5e_128',['operator^',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9afbc19e8756efdbc92e17d096540ce5',1,'cv::MatExpr::operator^(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abc36e16ecd042df954771a99068a6c49',1,'cv::MatExpr::operator^(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9867b0d5e11c2fef494b71e51d21da1b',1,'cv::MatExpr::operator^(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a15cd0aff27ba61cb2563894b01547e7e',1,'cv::MatExpr::operator^(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac559f4bd48f3660ee56a223258dc6bb9',1,'cv::MatExpr::operator^(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9afbc19e8756efdbc92e17d096540ce5',1,'cv::MatExpr::operator^(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#abc36e16ecd042df954771a99068a6c49',1,'cv::MatExpr::operator^(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a9867b0d5e11c2fef494b71e51d21da1b',1,'cv::MatExpr::operator^(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a15cd0aff27ba61cb2563894b01547e7e',1,'cv::MatExpr::operator^(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#ac559f4bd48f3660ee56a223258dc6bb9',1,'cv::MatExpr::operator^(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga7c759a9f061d90e4c6dac60aa74fb986',1,'cv::operator^()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f2db1ff7a6beee9d6abb68fca5486',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19bb391512f5ba4c2fee17b49f482269',1,'cv::cudev::operator^(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6996ae50fe4252f163301d6440a5c244',1,'cv::cudev::operator^(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35bf74a15b738d8b54e7bc12bbae0993',1,'cv::cudev::operator^(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae841dcb6dd5dbac738ea6f92c8c68b68',1,'cv::cudev::operator^(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga382357929ae811bbfc4e808b4e3bc8f2',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b81aa937cefb46d9896886aeeaa883c',1,'cv::cudev::operator^(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68a8e460780b94e85614d7785cbd3cb2',1,'cv::cudev::operator^(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7067102ad5f321c066fa7f2db3566b63',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff97ad64d1178cb4f6022f6c046d9e19',1,'cv::cudev::operator^(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae05c59b91c6841b7b4513e54e6de72db',1,'cv::cudev::operator^(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga553a0ab64e059b30e81c8ab8802d1ddf',1,'cv::cudev::operator^(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce073b221be8f03e1af8d35b795efa5',1,'cv::cudev::operator^(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae247dcb0213e92795a12085731f99b49',1,'cv::cudev::operator^(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f61a3af63ded7c934b5859eefd1e108',1,'cv::cudev::operator^(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa347f52f3f818f094c59a9cdf1f18ae8',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fad8e805a97475f06edef6af6bf976c',1,'cv::cudev::operator^(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9546d5b0db6ba30340fb1d19a1428be',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee3dfc9cff4b1d5f64e0351e091d27f',1,'cv::cudev::operator^(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7221d69a134b0ef5b08e97bb968d0762',1,'cv::cudev::operator^(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68fca21ce958616bb3cce2827c81bcb1',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga219e0d330b1ae4f6c55ef2bc9cd61b54',1,'cv::cudev::operator^(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c7b83d9c2a632dacbcd26a6bc71fcb8',1,'cv::cudev::operator^(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc55eed4cb6100456719dd7d42ab840',1,'cv::cudev::operator^(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa05edd1f94210980d40ecd8615e6cd',1,'cv::cudev::operator^(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57b0beb61b6838a8997630c88d57b1c0',1,'cv::cudev::operator^(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga574dbf94893fb637932048a1da56f61e',1,'cv::cudev::operator^(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a2d82b647bfdd3d8b9f555255b08446',1,'cv::cudev::operator^(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67b57ea4eeeb2dfc404c0596ad12a003',1,'cv::cudev::operator^(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f084768a0834cb515abe7cc12e5a5c2',1,'cv::cudev::operator^(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga262bbf2d811490645625b3c0819db5a9',1,'cv::cudev::operator^(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9008ea56e80e41f137fae6c4f29c5e2c',1,'cv::cudev::operator^(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b226fe3a602b25eb493c5b47675b115',1,'cv::cudev::operator^(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f177c946e1c5b13bda7e1a4d6b14792',1,'cv::cudev::operator^(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba1a42db310a4daf0fb2865aaf7f5201',1,'cv::cudev::operator^(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb9bef1f86ce4022e33132f5a80b4ae',1,'cv::cudev::operator^(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeaf6f4ae0c4adbf3594389355fc10fc6',1,'cv::cudev::operator^(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6307095b70d98cfb7875659cd516c9d7',1,'cv::cudev::operator^(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga276ef3a39dccd5a558013568f8e10634',1,'cv::cudev::operator^(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b709e4bac601f7322655f2bdb989cae',1,'cv::cudev::operator^(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2081fb9edca3a8318295766946442143',1,'cv::cudev::operator^(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42a42be02e720782ac6d6a890f87df34',1,'cv::cudev::operator^(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf503ce80b70d5e95589c6bcc5dcdc534',1,'cv::cudev::operator^(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86b5ec62d72169a5af71fbef20395bf7',1,'cv::cudev::operator^(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc0fe10ccf8bffd6a42d61a2cb7b7630',1,'cv::cudev::operator^(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29e1fa7243c5a45d5b4a8333ef5e4ad4',1,'cv::cudev::operator^(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace59218cd1224e9bd4e71d44effb706e',1,'cv::cudev::operator^(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb305d044d1d79eaa26884fa8691b13c',1,'cv::cudev::operator^(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92297263151c479220003960e6c94826',1,'cv::cudev::operator^(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23dec7e74c18bf4befb0e357ffada712',1,'cv::cudev::operator^(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc8b1ea1436679399d6de28a93f37c7c',1,'cv::cudev::operator^(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cdbc34390912374b3c016740db6e5a1',1,'cv::cudev::operator^(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga562e145a0cc65fa6571d18d0b5304fcd',1,'cv::cudev::operator^(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1487d3dd6d9e842c3f266fdef9b3cd06',1,'cv::cudev::operator^(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bdf640af5ef6c8037f04d2a21f72624',1,'cv::cudev::operator^(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be79933bce514a940a915865400b1be',1,'cv::cudev::operator^(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa8c7b4fcf0364baf63899bab7585b4',1,'cv::cudev::operator^(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c856e8c20c27045d1016b675fea6c29',1,'cv::cudev::operator^(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a4d4f19b1228d8c35964c9631b12db1',1,'cv::cudev::operator^(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc9f85f2cd8647cac819333b0b5d90d2',1,'cv::cudev::operator^(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed751d867269bace54872e57a083af43',1,'cv::cudev::operator^(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9d23aba1973ca8fd1ea7c710c89d9c9',1,'cv::cudev::operator^(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a5b7d75125123f6c481b6b5335baf5',1,'cv::cudev::operator^(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1860e2d6fbcabfd958136c1d2a873565',1,'cv::cudev::operator^(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7064aa0e201b06e6456b7225ab13b76f',1,'cv::cudev::operator^(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182950bf07b543f15aef63a570a75740',1,'cv::cudev::operator^(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7cb4644f2a37866175abd213e99bf9c',1,'cv::cudev::operator^(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga106351f7f67aac5a4539cf2da429051b',1,'cv::cudev::operator^(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5c2aa1114fc5bc919fecf84836a85bb',1,'cv::cudev::operator^(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e81b5c59f5873a9b2b355605d4628c4',1,'cv::cudev::operator^(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24aac76e0a255dbf62c78f3f5ac1b4d6',1,'cv::cudev::operator^(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7de7a8c28d3b5cc29651d6128ca2d910',1,'cv::cudev::operator^(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f1c529d765c81d140c77108626aa14a',1,'cv::cudev::operator^(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef0821f6c671d9712c7238465f8d4884',1,'cv::cudev::operator^(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2daad5e0b4930181e2e66c9f17f93c20',1,'cv::cudev::operator^(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ff5a2a334e85c74b8286600064aae8b',1,'cv::cudev::operator^(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63ccaabd5ee595473b9dc5bd77d9948e',1,'cv::cudev::operator^(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab653e7053862a95e577b8db3322dd49c',1,'cv::cudev::operator^(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6976070c4b0ebc9d2ac34bc7c325b112',1,'cv::cudev::operator^(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147cb8d515df77bc9dda9bd957c21a75',1,'cv::cudev::operator^(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8caa79576d2640d9c571dcbf39c41f9e',1,'cv::cudev::operator^(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga536c9c60a5f68e761b71f7a521bd440f',1,'cv::cudev::operator^(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga309e3255d388c6334fa4baccb66c39c4',1,'cv::cudev::operator^(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga844cecceba28036b2ef12a014b0ccfb7',1,'cv::cudev::operator^(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga930dfc19c86c269dba903a06651d79b1',1,'cv::cudev::operator^(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc31b023630642daa958687ede735dc',1,'cv::cudev::operator^(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga260712aebe5466a8e4f01ea498d2ca02',1,'cv::cudev::operator^(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09aac80f9054e642a162795b850c973b',1,'cv::cudev::operator^(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056a095b396077c1a14f6e237ba69f62',1,'cv::cudev::operator^(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4424230c30d8785f0c7ecb0903651540',1,'cv::cudev::operator^(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b85716ad8e68247c20bbf301d5db78b',1,'cv::cudev::operator^(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61455fe5de691c1102ebec11128de52a',1,'cv::cudev::operator^(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga754806ed446290afea054d4cab646e54',1,'cv::cudev::operator^(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd6445fdc04ff5606d05f981dac957ee',1,'cv::cudev::operator^(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3903754f858daaf6174edeec6c964db1',1,'cv::cudev::operator^(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ae473eb2417fa915fb5d169be28d0d6',1,'cv::cudev::operator^(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga7c759a9f061d90e4c6dac60aa74fb986',1,'operator^(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c1f2db1ff7a6beee9d6abb68fca5486',1,'operator^(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19bb391512f5ba4c2fee17b49f482269',1,'operator^(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6996ae50fe4252f163301d6440a5c244',1,'operator^(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga35bf74a15b738d8b54e7bc12bbae0993',1,'operator^(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae841dcb6dd5dbac738ea6f92c8c68b68',1,'operator^(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga382357929ae811bbfc4e808b4e3bc8f2',1,'operator^(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7b81aa937cefb46d9896886aeeaa883c',1,'operator^(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68a8e460780b94e85614d7785cbd3cb2',1,'operator^(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7067102ad5f321c066fa7f2db3566b63',1,'operator^(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff97ad64d1178cb4f6022f6c046d9e19',1,'operator^(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae05c59b91c6841b7b4513e54e6de72db',1,'operator^(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga553a0ab64e059b30e81c8ab8802d1ddf',1,'operator^(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce073b221be8f03e1af8d35b795efa5',1,'operator^(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae247dcb0213e92795a12085731f99b49',1,'operator^(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6f61a3af63ded7c934b5859eefd1e108',1,'operator^(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa347f52f3f818f094c59a9cdf1f18ae8',1,'operator^(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fad8e805a97475f06edef6af6bf976c',1,'operator^(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9546d5b0db6ba30340fb1d19a1428be',1,'operator^(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee3dfc9cff4b1d5f64e0351e091d27f',1,'operator^(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7221d69a134b0ef5b08e97bb968d0762',1,'operator^(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga68fca21ce958616bb3cce2827c81bcb1',1,'operator^(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga219e0d330b1ae4f6c55ef2bc9cd61b54',1,'operator^(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c7b83d9c2a632dacbcd26a6bc71fcb8',1,'operator^(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc55eed4cb6100456719dd7d42ab840',1,'operator^(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1aa05edd1f94210980d40ecd8615e6cd',1,'operator^(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57b0beb61b6838a8997630c88d57b1c0',1,'operator^(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga574dbf94893fb637932048a1da56f61e',1,'operator^(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2a2d82b647bfdd3d8b9f555255b08446',1,'operator^(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67b57ea4eeeb2dfc404c0596ad12a003',1,'operator^(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1f084768a0834cb515abe7cc12e5a5c2',1,'operator^(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga262bbf2d811490645625b3c0819db5a9',1,'operator^(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9008ea56e80e41f137fae6c4f29c5e2c',1,'operator^(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b226fe3a602b25eb493c5b47675b115',1,'operator^(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f177c946e1c5b13bda7e1a4d6b14792',1,'operator^(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba1a42db310a4daf0fb2865aaf7f5201',1,'operator^(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8fb9bef1f86ce4022e33132f5a80b4ae',1,'operator^(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeaf6f4ae0c4adbf3594389355fc10fc6',1,'operator^(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6307095b70d98cfb7875659cd516c9d7',1,'operator^(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga276ef3a39dccd5a558013568f8e10634',1,'operator^(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b709e4bac601f7322655f2bdb989cae',1,'operator^(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2081fb9edca3a8318295766946442143',1,'operator^(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga42a42be02e720782ac6d6a890f87df34',1,'operator^(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf503ce80b70d5e95589c6bcc5dcdc534',1,'operator^(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86b5ec62d72169a5af71fbef20395bf7',1,'operator^(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc0fe10ccf8bffd6a42d61a2cb7b7630',1,'operator^(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga29e1fa7243c5a45d5b4a8333ef5e4ad4',1,'operator^(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace59218cd1224e9bd4e71d44effb706e',1,'operator^(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabb305d044d1d79eaa26884fa8691b13c',1,'operator^(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga92297263151c479220003960e6c94826',1,'operator^(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga23dec7e74c18bf4befb0e357ffada712',1,'operator^(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc8b1ea1436679399d6de28a93f37c7c',1,'operator^(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cdbc34390912374b3c016740db6e5a1',1,'operator^(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga562e145a0cc65fa6571d18d0b5304fcd',1,'operator^(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1487d3dd6d9e842c3f266fdef9b3cd06',1,'operator^(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7bdf640af5ef6c8037f04d2a21f72624',1,'operator^(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1be79933bce514a940a915865400b1be',1,'operator^(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2fa8c7b4fcf0364baf63899bab7585b4',1,'operator^(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7c856e8c20c27045d1016b675fea6c29',1,'operator^(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3a4d4f19b1228d8c35964c9631b12db1',1,'operator^(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabc9f85f2cd8647cac819333b0b5d90d2',1,'operator^(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed751d867269bace54872e57a083af43',1,'operator^(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad9d23aba1973ca8fd1ea7c710c89d9c9',1,'operator^(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae3a5b7d75125123f6c481b6b5335baf5',1,'operator^(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1860e2d6fbcabfd958136c1d2a873565',1,'operator^(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7064aa0e201b06e6456b7225ab13b76f',1,'operator^(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga182950bf07b543f15aef63a570a75740',1,'operator^(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae7cb4644f2a37866175abd213e99bf9c',1,'operator^(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga106351f7f67aac5a4539cf2da429051b',1,'operator^(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac5c2aa1114fc5bc919fecf84836a85bb',1,'operator^(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e81b5c59f5873a9b2b355605d4628c4',1,'operator^(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24aac76e0a255dbf62c78f3f5ac1b4d6',1,'operator^(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7de7a8c28d3b5cc29651d6128ca2d910',1,'operator^(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f1c529d765c81d140c77108626aa14a',1,'operator^(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef0821f6c671d9712c7238465f8d4884',1,'operator^(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2daad5e0b4930181e2e66c9f17f93c20',1,'operator^(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0ff5a2a334e85c74b8286600064aae8b',1,'operator^(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga63ccaabd5ee595473b9dc5bd77d9948e',1,'operator^(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab653e7053862a95e577b8db3322dd49c',1,'operator^(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6976070c4b0ebc9d2ac34bc7c325b112',1,'operator^(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga147cb8d515df77bc9dda9bd957c21a75',1,'operator^(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8caa79576d2640d9c571dcbf39c41f9e',1,'operator^(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga536c9c60a5f68e761b71f7a521bd440f',1,'operator^(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga309e3255d388c6334fa4baccb66c39c4',1,'operator^(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga844cecceba28036b2ef12a014b0ccfb7',1,'operator^(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga930dfc19c86c269dba903a06651d79b1',1,'operator^(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacfc31b023630642daa958687ede735dc',1,'operator^(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga260712aebe5466a8e4f01ea498d2ca02',1,'operator^(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga09aac80f9054e642a162795b850c973b',1,'operator^(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga056a095b396077c1a14f6e237ba69f62',1,'operator^(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4424230c30d8785f0c7ecb0903651540',1,'operator^(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9b85716ad8e68247c20bbf301d5db78b',1,'operator^(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga61455fe5de691c1102ebec11128de52a',1,'operator^(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga754806ed446290afea054d4cab646e54',1,'operator^(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacd6445fdc04ff5606d05f981dac957ee',1,'operator^(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3903754f858daaf6174edeec6c964db1',1,'operator^(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ae473eb2417fa915fb5d169be28d0d6',1,'operator^(uint s, const uint4 &b)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a0eec0ec1834b05e931022533e2ae4d03',1,'std::operator^()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a99429d2419718d6f9cf98153cb104a57',1,'std::regex_constants::operator^(syntax_option_type __a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ac6b912c67d2cdd494a770cd23c1b4f98',1,'std::regex_constants::operator^(match_flag_type __a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga7c9b5309fab61ddf049e350fdaa599fe',1,'std::tr2::operator^()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#ga7c9b5309fab61ddf049e350fdaa599fe',1,'operator^()(Global Namespace)']]], + ['operator_5e_3d_129',['operator^=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa9ac8697d02b2a3bacc58b1fa619b630',1,'std::bitset::operator^=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#aa9ac8697d02b2a3bacc58b1fa619b630',1,'std::bitset::operator^=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa45daae152fd32ab851c56779fc1e13c',1,'std::gslice_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga335663b1692606f8a5d96324592d4785',1,'std::indirect_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gab7b73360db81555ebc04e3c482a94857',1,'std::mask_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga262449de3e39bbae18ab3bb911b2eb8b',1,'std::slice_array::operator^=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#adf5d449d2357108981b85b43f05114e7',1,'std::tr2::dynamic_bitset::operator^=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#adf5d449d2357108981b85b43f05114e7',1,'std::tr2::dynamic_bitset::operator^=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga12372c525f0ae4cdeb7180c7337b57ed',1,'std::valarray::operator^=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga945c098affa36e4df42895bca9937b61',1,'std::valarray::operator^=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga12372c525f0ae4cdeb7180c7337b57ed',1,'valarray< size_t >::operator^=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga945c098affa36e4df42895bca9937b61',1,'valarray< size_t >::operator^=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gadd58fb6b2720ce0e68d9665ddee198f9',1,'cv::operator^=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gadd58fb6b2720ce0e68d9665ddee198f9',1,'operator^=()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a782f3bd1b71adf5bc9f337b74ccb169d',1,'std::regex_constants::operator^=(syntax_option_type &__a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a6edeffe99c8db99f7d365da413e65c34',1,'std::regex_constants::operator^=(match_flag_type &__a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaa45daae152fd32ab851c56779fc1e13c',1,'operator^=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga12372c525f0ae4cdeb7180c7337b57ed',1,'operator^=(const _Tp &)(Global Namespace)']]], + ['operatorinversesqrt_130',['operatorInverseSqrt',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#ae4b13fe4ce22faf74e50d346fc51a66e',1,'Eigen::SelfAdjointEigenSolver']]], + ['operatornorm_131',['operatorNorm',['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ff9bc0b9bea2d0822a2bf3192783102',1,'Eigen::MatrixBase::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ff9bc0b9bea2d0822a2bf3192783102',1,'MatrixBase< Homogeneous< MatrixType, _Direction > >::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1MatrixBase.html#a0ff9bc0b9bea2d0822a2bf3192783102',1,'MatrixBase< Solve< Decomposition, RhsType > >::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a12a7da482e31ec9c517dca92dd7bae61',1,'Eigen::SelfAdjointView::operatorNorm()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#a12a7da482e31ec9c517dca92dd7bae61',1,'SelfAdjointView< const Derived, UpLo >::operatorNorm()']]], + ['operatorsqrt_132',['operatorSqrt',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointEigenSolver.html#aeeedb2ae618f21a4eb59465746c1cee5',1,'Eigen::SelfAdjointEigenSolver']]], + ['operator_7c_133',['operator|',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8938333ac6cc65c2cc4a21071b22df56',1,'cv::MatExpr::operator|(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aeac05ffd3d5c1d6c803e46a5ed380a95',1,'cv::MatExpr::operator|(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27c1238f43dfbf691c3da8b9bcbe8622',1,'cv::MatExpr::operator|(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acaa29c7d0f130d120737fcb3c5dac54d',1,'cv::MatExpr::operator|(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aab1250c235649a10a478a88394b23fda',1,'cv::MatExpr::operator|(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a8938333ac6cc65c2cc4a21071b22df56',1,'cv::MatExpr::operator|(const Mat &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aeac05ffd3d5c1d6c803e46a5ed380a95',1,'cv::MatExpr::operator|(const Mat &a, const Scalar &s)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a27c1238f43dfbf691c3da8b9bcbe8622',1,'cv::MatExpr::operator|(const Scalar &s, const Mat &a)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#acaa29c7d0f130d120737fcb3c5dac54d',1,'cv::MatExpr::operator|(const Mat &a, const Matx< _Tp, m, n > &b)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#aab1250c235649a10a478a88394b23fda',1,'cv::MatExpr::operator|(const Matx< _Tp, m, n > &a, const Mat &b)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga08e30fb25ccd0e148c11eab8f9b0daaf',1,'cv::operator|()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72373b516825ad78e4c3db1918858a03',1,'cv::cudev::operator|(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6817a3e829bea52da01ea49c16839597',1,'cv::cudev::operator|(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b61ec46777577e1395990626361d82',1,'cv::cudev::operator|(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e5ac5a0d8c733bee304065ea5d10c5c',1,'cv::cudev::operator|(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb491ada5fa699f281393e20bad19c59',1,'cv::cudev::operator|(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga140d231543d1ec29d211aa7b6aae1f9e',1,'cv::cudev::operator|(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeec118fb2a44a56ccc4242809ef2ee45',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8765a933b0b5adf61c098fbf191a8f69',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga494eb039f25f4b355015e048e65ae92a',1,'cv::cudev::operator|(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67f56e5f79c0c5a8d35924a320e8035',1,'cv::cudev::operator|(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7e1dd96697340c2af8b08e71f65f058',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga214e51557127c9dbf5822af3b7e4086f',1,'cv::cudev::operator|(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbf444dd7ea65e673b383fdc24b7b9bc',1,'cv::cudev::operator|(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71bf7e7b2a0722518d460c2ef26bd009',1,'cv::cudev::operator|(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4c0138f513cd7e6f2ec5c673baa9430',1,'cv::cudev::operator|(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630597efc5d5a29f689f5f73b6cc2057',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79dea7d19820e4a739fb7927daff522f',1,'cv::cudev::operator|(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a62899f4dfb4a4a51fc9e18ced6b236',1,'cv::cudev::operator|(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ebd78b7e25610fdca444e53b9124af1',1,'cv::cudev::operator|(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga619519d7e0cbc71f88dcf10af8bdc3e4',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad952cc55d6204ec9648e8e226307f433',1,'cv::cudev::operator|(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99e794f6c32bf7a1e18e28e5cd76b3f0',1,'cv::cudev::operator|(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6285d927a8d75294be444e2923d4015d',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddeb8331934690f04aca52ec3d485468',1,'cv::cudev::operator|(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eae7ed305c1f6f0d697cf6b5513b52c',1,'cv::cudev::operator|(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48ef824b54938a4efab1d92d2547b6ff',1,'cv::cudev::operator|(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b91ed6a653874c97911addea7492e88',1,'cv::cudev::operator|(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a7ba688aec7b3bc93dfd03efb7a0a1',1,'cv::cudev::operator|(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0df3c76006f995c76b73f820597058d3',1,'cv::cudev::operator|(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33dc3b6cc908d682b8b4b924037462a8',1,'cv::cudev::operator|(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa67b59a7a6af82dad9017aeb8a9af3',1,'cv::cudev::operator|(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3471e18d63b852c4eb063e1ccf2a9d1',1,'cv::cudev::operator|(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e682a0014ba8daf79be5ea7b234da6f',1,'cv::cudev::operator|(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6cb1874e00d5f309b08b23fa3135867',1,'cv::cudev::operator|(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e888e4f12d42f958c274ae74b5b8fcf',1,'cv::cudev::operator|(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga926b508cb3586f7e8b26e7ab4f3a36d9',1,'cv::cudev::operator|(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga347152b541965b0706b8883c77ab59d1',1,'cv::cudev::operator|(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b428f7caf6c47e78c4ee870da69a5bb',1,'cv::cudev::operator|(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f6ed6bde6e724a15b3d462ad5fff304',1,'cv::cudev::operator|(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755c6b9eed56b86c14c166120150cf5a',1,'cv::cudev::operator|(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ac29af04d3ff28282099ae43d64c1eb',1,'cv::cudev::operator|(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5168caae872a1693252bf524ca06a971',1,'cv::cudev::operator|(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b04c7e2bf05018eff5107b8b21d834f',1,'cv::cudev::operator|(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fa19097be382eb043bc1947c99527bf',1,'cv::cudev::operator|(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dc4e4e7647a0a14bfaf036a293f7c20',1,'cv::cudev::operator|(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c4229c9c4d01aae2eb3c68b6d295a5d',1,'cv::cudev::operator|(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga089d5fc24f8caba2cd4157d4c72acd16',1,'cv::cudev::operator|(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4df0525a2ea1daa49391935fd6096f82',1,'cv::cudev::operator|(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a144b52934da855d744f0f6821ad443',1,'cv::cudev::operator|(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41753a5acd49f58734c7f0b2b906c820',1,'cv::cudev::operator|(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga066869163b1bdbd4100bdc23a675e905',1,'cv::cudev::operator|(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0631c1ac1e1d609ce0a5a20bc12d61a5',1,'cv::cudev::operator|(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64863e5f445a3cb5b5f5900dbb2d1cb6',1,'cv::cudev::operator|(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga843f54b435b967d9fcb1259ebe47d149',1,'cv::cudev::operator|(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4f44f5d07e21c6d6e891fe50f7a95c3',1,'cv::cudev::operator|(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e22900c73b91968a336722095dee82f',1,'cv::cudev::operator|(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19056ea37b866c0f7f7e47b9d1d06c56',1,'cv::cudev::operator|(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga153845e401bd20e6df63bedfaf7d7740',1,'cv::cudev::operator|(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efc7c5881e23be48037958261a0496f',1,'cv::cudev::operator|(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85a70d4dfeb3063b32cbe3db7f75cb8a',1,'cv::cudev::operator|(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga305080aaf14a3ac0997ad739d57372c7',1,'cv::cudev::operator|(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a0a8103dfd6807e20fcd226e5cd3aec',1,'cv::cudev::operator|(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14769e6c0a5b2888af00d0ceb63fc090',1,'cv::cudev::operator|(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b29a922cca4534da997e1800dbccc0f',1,'cv::cudev::operator|(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1cc5655efe72e5d9e95279d76e1d48e',1,'cv::cudev::operator|(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd8cbff79c1cace2db279f6de7a0681',1,'cv::cudev::operator|(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac38b34c8a76b66b0466166192db5d2e6',1,'cv::cudev::operator|(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236fa0260af6ef2b14fadba155fe5abe',1,'cv::cudev::operator|(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37dad1dbb748b11a1193be946b3722a1',1,'cv::cudev::operator|(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9803d4b0e3d1a0167830a72715b0c04e',1,'cv::cudev::operator|(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77b5075254d12609ad87bed4527633a4',1,'cv::cudev::operator|(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf719b791735f78195bfe29926f1b0ab7',1,'cv::cudev::operator|(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3689763321a43eacdd8d773eb2c70712',1,'cv::cudev::operator|(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572df6ef6d0112b56753ba4014881e53',1,'cv::cudev::operator|(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6457d3d1d93c0166976483a2f951ee3d',1,'cv::cudev::operator|(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91b74f2c70bcedc67c9df84a02addb79',1,'cv::cudev::operator|(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a47b495c6be9943d7cd3a7f7fd616f',1,'cv::cudev::operator|(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab07096b3294af7bcec98722b2446e479',1,'cv::cudev::operator|(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ed7b2138bc1f9497aa3c07b3dd5a07f',1,'cv::cudev::operator|(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaace76c0789620825414ff7a595ef5911',1,'cv::cudev::operator|(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6a261516077c0b79a742b166cfc07a0',1,'cv::cudev::operator|(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16512210aee4858a3ab481592bf74f1c',1,'cv::cudev::operator|(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2438bf2b14756d6e5ed3bad3b3c1e1ec',1,'cv::cudev::operator|(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ae3b6aa8f01802bd73dc969d72fabc5',1,'cv::cudev::operator|(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ead05d032040865f64cd3f8f1e0547',1,'cv::cudev::operator|(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62e550301aa3c7d81e282e7b5eb3020a',1,'cv::cudev::operator|(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac167061f4c1ca73369f88716e8989984',1,'cv::cudev::operator|(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafe49b72410fc249acf6ec30c4af1de5',1,'cv::cudev::operator|(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0385791a7e492043910a3c6d9633f1e',1,'cv::cudev::operator|(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f53c51e5f229c2d88d5820a0c1bf963',1,'cv::cudev::operator|(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef6dcabe2a6d79eb4f75768d54ddb701',1,'cv::cudev::operator|(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ccfb5c0cc94544213a31f2cca13c615',1,'cv::cudev::operator|(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32e508cfe66f331a33b2f3da6e900404',1,'cv::cudev::operator|(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga085e8a5af5cec776858566322bde16fe',1,'cv::cudev::operator|(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3050373d10dc996186ca8f35ae0d0bf',1,'cv::cudev::operator|(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24144ec0fb8b6b445ab0a1ee9e41da15',1,'cv::cudev::operator|(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga08e30fb25ccd0e148c11eab8f9b0daaf',1,'operator|(const v_reg< _Tp, n > &a, const v_reg< _Tp, n > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga72373b516825ad78e4c3db1918858a03',1,'operator|(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6817a3e829bea52da01ea49c16839597',1,'operator|(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19b61ec46777577e1395990626361d82',1,'operator|(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7e5ac5a0d8c733bee304065ea5d10c5c',1,'operator|(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb491ada5fa699f281393e20bad19c59',1,'operator|(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga140d231543d1ec29d211aa7b6aae1f9e',1,'operator|(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaeec118fb2a44a56ccc4242809ef2ee45',1,'operator|(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8765a933b0b5adf61c098fbf191a8f69',1,'operator|(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga494eb039f25f4b355015e048e65ae92a',1,'operator|(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf67f56e5f79c0c5a8d35924a320e8035',1,'operator|(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab7e1dd96697340c2af8b08e71f65f058',1,'operator|(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga214e51557127c9dbf5822af3b7e4086f',1,'operator|(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabbf444dd7ea65e673b383fdc24b7b9bc',1,'operator|(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga71bf7e7b2a0722518d460c2ef26bd009',1,'operator|(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4c0138f513cd7e6f2ec5c673baa9430',1,'operator|(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630597efc5d5a29f689f5f73b6cc2057',1,'operator|(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79dea7d19820e4a739fb7927daff522f',1,'operator|(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9a62899f4dfb4a4a51fc9e18ced6b236',1,'operator|(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ebd78b7e25610fdca444e53b9124af1',1,'operator|(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga619519d7e0cbc71f88dcf10af8bdc3e4',1,'operator|(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad952cc55d6204ec9648e8e226307f433',1,'operator|(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99e794f6c32bf7a1e18e28e5cd76b3f0',1,'operator|(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6285d927a8d75294be444e2923d4015d',1,'operator|(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaddeb8331934690f04aca52ec3d485468',1,'operator|(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7eae7ed305c1f6f0d697cf6b5513b52c',1,'operator|(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga48ef824b54938a4efab1d92d2547b6ff',1,'operator|(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4b91ed6a653874c97911addea7492e88',1,'operator|(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a7ba688aec7b3bc93dfd03efb7a0a1',1,'operator|(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0df3c76006f995c76b73f820597058d3',1,'operator|(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga33dc3b6cc908d682b8b4b924037462a8',1,'operator|(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6aa67b59a7a6af82dad9017aeb8a9af3',1,'operator|(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad3471e18d63b852c4eb063e1ccf2a9d1',1,'operator|(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e682a0014ba8daf79be5ea7b234da6f',1,'operator|(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae6cb1874e00d5f309b08b23fa3135867',1,'operator|(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8e888e4f12d42f958c274ae74b5b8fcf',1,'operator|(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga926b508cb3586f7e8b26e7ab4f3a36d9',1,'operator|(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga347152b541965b0706b8883c77ab59d1',1,'operator|(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b428f7caf6c47e78c4ee870da69a5bb',1,'operator|(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7f6ed6bde6e724a15b3d462ad5fff304',1,'operator|(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga755c6b9eed56b86c14c166120150cf5a',1,'operator|(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6ac29af04d3ff28282099ae43d64c1eb',1,'operator|(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5168caae872a1693252bf524ca06a971',1,'operator|(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5b04c7e2bf05018eff5107b8b21d834f',1,'operator|(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fa19097be382eb043bc1947c99527bf',1,'operator|(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2dc4e4e7647a0a14bfaf036a293f7c20',1,'operator|(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c4229c9c4d01aae2eb3c68b6d295a5d',1,'operator|(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga089d5fc24f8caba2cd4157d4c72acd16',1,'operator|(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4df0525a2ea1daa49391935fd6096f82',1,'operator|(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6a144b52934da855d744f0f6821ad443',1,'operator|(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41753a5acd49f58734c7f0b2b906c820',1,'operator|(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga066869163b1bdbd4100bdc23a675e905',1,'operator|(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0631c1ac1e1d609ce0a5a20bc12d61a5',1,'operator|(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64863e5f445a3cb5b5f5900dbb2d1cb6',1,'operator|(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga843f54b435b967d9fcb1259ebe47d149',1,'operator|(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae4f44f5d07e21c6d6e891fe50f7a95c3',1,'operator|(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2e22900c73b91968a336722095dee82f',1,'operator|(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga19056ea37b866c0f7f7e47b9d1d06c56',1,'operator|(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga153845e401bd20e6df63bedfaf7d7740',1,'operator|(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0efc7c5881e23be48037958261a0496f',1,'operator|(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga85a70d4dfeb3063b32cbe3db7f75cb8a',1,'operator|(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga305080aaf14a3ac0997ad739d57372c7',1,'operator|(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7a0a8103dfd6807e20fcd226e5cd3aec',1,'operator|(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14769e6c0a5b2888af00d0ceb63fc090',1,'operator|(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b29a922cca4534da997e1800dbccc0f',1,'operator|(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf1cc5655efe72e5d9e95279d76e1d48e',1,'operator|(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4cd8cbff79c1cace2db279f6de7a0681',1,'operator|(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac38b34c8a76b66b0466166192db5d2e6',1,'operator|(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga236fa0260af6ef2b14fadba155fe5abe',1,'operator|(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37dad1dbb748b11a1193be946b3722a1',1,'operator|(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9803d4b0e3d1a0167830a72715b0c04e',1,'operator|(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77b5075254d12609ad87bed4527633a4',1,'operator|(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf719b791735f78195bfe29926f1b0ab7',1,'operator|(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3689763321a43eacdd8d773eb2c70712',1,'operator|(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga572df6ef6d0112b56753ba4014881e53',1,'operator|(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6457d3d1d93c0166976483a2f951ee3d',1,'operator|(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga91b74f2c70bcedc67c9df84a02addb79',1,'operator|(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga06a47b495c6be9943d7cd3a7f7fd616f',1,'operator|(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab07096b3294af7bcec98722b2446e479',1,'operator|(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8ed7b2138bc1f9497aa3c07b3dd5a07f',1,'operator|(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaace76c0789620825414ff7a595ef5911',1,'operator|(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad6a261516077c0b79a742b166cfc07a0',1,'operator|(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga16512210aee4858a3ab481592bf74f1c',1,'operator|(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2438bf2b14756d6e5ed3bad3b3c1e1ec',1,'operator|(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ae3b6aa8f01802bd73dc969d72fabc5',1,'operator|(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga05ead05d032040865f64cd3f8f1e0547',1,'operator|(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62e550301aa3c7d81e282e7b5eb3020a',1,'operator|(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac167061f4c1ca73369f88716e8989984',1,'operator|(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaafe49b72410fc249acf6ec30c4af1de5',1,'operator|(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae0385791a7e492043910a3c6d9633f1e',1,'operator|(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8f53c51e5f229c2d88d5820a0c1bf963',1,'operator|(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaef6dcabe2a6d79eb4f75768d54ddb701',1,'operator|(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5ccfb5c0cc94544213a31f2cca13c615',1,'operator|(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32e508cfe66f331a33b2f3da6e900404',1,'operator|(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga085e8a5af5cec776858566322bde16fe',1,'operator|(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3050373d10dc996186ca8f35ae0d0bf',1,'operator|(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga24144ec0fb8b6b445ab0a1ee9e41da15',1,'operator|(const uint3 &a, uint s)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#a37b7f9acb3d4f471410857a524425f03',1,'std::operator|()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#aed34b3d93916973cfea2af94c22ac505',1,'std::regex_constants::operator|(syntax_option_type __a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a510d0810f0fe55a65a1f3ad142e95e2c',1,'std::regex_constants::operator|(match_flag_type __a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gad20c154d9a0dc8523781b0d2fe0d3de1',1,'std::tr2::operator|()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html#gad20c154d9a0dc8523781b0d2fe0d3de1',1,'operator|()(Global Namespace)']]], + ['operator_7c_3d_134',['operator|=',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a75853927c9ad1aa9548e9eea7fde188c',1,'std::bitset::operator|=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a75853927c9ad1aa9548e9eea7fde188c',1,'std::bitset::operator|=(const bitset< _Nb > &__rhs) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga87a6054e3d3df9b3b828c86d7b71a7d0',1,'std::gslice_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga349500cff6b300c39a505e9c74943b86',1,'std::indirect_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga684708f251addb2566756f4d2eedee36',1,'std::mask_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga0cfe83bfd0c60d5f1b393bbddcc70889',1,'std::slice_array::operator|=()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a4db104deaf30025db9b8064f29fa29f8',1,'std::tr2::dynamic_bitset::operator|=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#a4db104deaf30025db9b8064f29fa29f8',1,'std::tr2::dynamic_bitset::operator|=(const dynamic_bitset &__rhs)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf20cc6bf249d338dd1fdb26f4363ee2e',1,'std::valarray::operator|=(const _Tp &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2082939513c0702ce488c2dc27e98951',1,'std::valarray::operator|=(const valarray< _Tp > &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf20cc6bf249d338dd1fdb26f4363ee2e',1,'valarray< size_t >::operator|=(const size_t &)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga2082939513c0702ce488c2dc27e98951',1,'valarray< size_t >::operator|=(const valarray< size_t > &)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaad93bb02fc5c3c4c248b1dbb8a7348fe',1,'cv::operator|=()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#gaad93bb02fc5c3c4c248b1dbb8a7348fe',1,'operator|=()(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a4bd5dcfb1f0eead5b8f66233f45638f4',1,'std::regex_constants::operator|=(syntax_option_type &__a, syntax_option_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a1cc70d79ada227928c10a6ae955a5527',1,'std::regex_constants::operator|=(match_flag_type &__a, match_flag_type __b)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga87a6054e3d3df9b3b828c86d7b71a7d0',1,'operator|=(const valarray< _Tp > &) const(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#gaf20cc6bf249d338dd1fdb26f4363ee2e',1,'operator|=(const _Tp &)(Global Namespace)']]], + ['operator_7c_7c_135',['operator||',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade405ae7fba00188385f79da087b473d',1,'cv::cudev::operator||(const Expr< Body > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67336d4da1a1a0e097576e110e322d17',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d9325273f75ec46a5d0ccaa698dcab2',1,'cv::cudev::operator||(const Expr< Body > &a, typename Body::value_type val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a350991d905802482a4a52516296256',1,'cv::cudev::operator||(const Expr< Body > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd38e92dca97e14285cb0a994eac2eb2',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1cf8719bfe35c1ce58b69439440ebb',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga407966ca821a5b21a0fa3669273ce155',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3f1b3a6297712114fb1528180bf4d5d',1,'cv::cudev::operator||(const Texture< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa60211ccc7148f580c9213f98d57d852',1,'cv::cudev::operator||(const Texture< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc492c09a30238356c29f992f434bbb',1,'cv::cudev::operator||(typename Body::value_type val, const Expr< Body > &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab229fbb04aea1adaf4ad5a99495035b9',1,'cv::cudev::operator||(const Texture< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac068c500d749dcf1c1b633a71343bf64',1,'cv::cudev::operator||(const GpuMat_< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfceb475fab9bf020cc18a7d00ce68fa',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga970bfbba082e36b082ec64f178fa4bc4',1,'cv::cudev::operator||(T val, const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451cabb9165a8cb76c8b8281a48a74c3',1,'cv::cudev::operator||(const Texture< T > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ed51988f3b066b935628ca0ca76c806',1,'cv::cudev::operator||(T val, const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56be341fd82bc471dc3727ac767df94d',1,'cv::cudev::operator||(const Expr< Body1 > &a, const Expr< Body2 > &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43139046dc0327bc12a3405a63c93e78',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const Expr< Body > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga759c70e663c4ff4e8d2ae8217d47a7d7',1,'cv::cudev::operator||(const Expr< Body > &src1, const GlobPtrSz< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64af392441e02098f668b91b581d6158',1,'cv::cudev::operator||(T val, const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9dfe768a49878db05bdb91ebe5a8759b',1,'cv::cudev::operator||(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga292fb2e70406a170f98347e3d2110db8',1,'cv::cudev::operator||(const Texture< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20d93bcf778f16d1853957cc42ff9eab',1,'cv::cudev::operator||(const GpuMat_< T > &src1, const Texture< T > &src2)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce18a713dc4adf2e6fc8841b69a7639',1,'cv::cudev::operator||(const GlobPtrSz< T > &src, T val)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf45510b81f8e1759112cecd4b5a4aa3',1,'cv::cudev::operator||(const uchar3 &a, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fe1c8b48957c39413aac5e3ffd90376',1,'cv::cudev::operator||(const uchar1 &a, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b56bd1f805e2cc2a433d784ea26764b',1,'cv::cudev::operator||(const uchar4 &a, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51f6411482c1c1dc459307997d262caa',1,'cv::cudev::operator||(const uchar2 &a, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae01ca019d7b9f4b726b7017dccfb97eb',1,'cv::cudev::operator||(const char2 &a, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c9b224b12822bc42b33d5371cf7cef4',1,'cv::cudev::operator||(const char1 &a, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdb8f03f5e8aded2d1c1f5b674f8d0be',1,'cv::cudev::operator||(const char3 &a, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga682b9e8e6d24725fbfd14afe04c746cc',1,'cv::cudev::operator||(const char4 &a, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f2c04274bc2e9ef0c0e64e835272570',1,'cv::cudev::operator||(const ushort4 &a, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9613bf79ecb44e0124d987c0dc603c0e',1,'cv::cudev::operator||(const ushort2 &a, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96c371efcc9fa6314c3997cabac8de8e',1,'cv::cudev::operator||(const ushort1 &a, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebbcb4c326b4d6504cd9400ac933f53e',1,'cv::cudev::operator||(const ushort3 &a, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6a798890ec4e1c957610419cbc07fa3',1,'cv::cudev::operator||(const short1 &a, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0637cf031452de7f45462f4cf7d20f0',1,'cv::cudev::operator||(const short4 &a, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3532b09926ae239bbfdcb638f8602895',1,'cv::cudev::operator||(const short2 &a, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga625848bfaa38a86a0132a1771535fddb',1,'cv::cudev::operator||(const short3 &a, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c08c399ce28a20e5849c10236e3ec1e',1,'cv::cudev::operator||(const int4 &a, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga446ac73d6fc9c701bf235f9530e05486',1,'cv::cudev::operator||(const int1 &a, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bdb1e714d4966bc3b89850c3f223aa6',1,'cv::cudev::operator||(const int2 &a, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d607a72c6d5edbf0c5f0defadeecfe9',1,'cv::cudev::operator||(const int3 &a, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc57b8d10acf24138375fc21e1799aeb',1,'cv::cudev::operator||(const uint1 &a, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b65fb035d930940ab0736ddbc0519fc',1,'cv::cudev::operator||(const uint3 &a, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1593e87e954982987925c25988dab81a',1,'cv::cudev::operator||(const uint4 &a, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0b4e24f07cae0bd5ef2032f1895b44',1,'cv::cudev::operator||(const uint2 &a, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb0588dab343533c00fe007f4e019f29',1,'cv::cudev::operator||(const float4 &a, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7db7c5c12deeb79a3ad18e230fd0028',1,'cv::cudev::operator||(const float2 &a, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99d4f17ca75885550288386f0959cfa5',1,'cv::cudev::operator||(const float3 &a, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56bd222aa931f4a2f6c330e6e49ed71c',1,'cv::cudev::operator||(const float1 &a, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53fea0cb9bdf3c6ad83ef37fe04f24dc',1,'cv::cudev::operator||(const double1 &a, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c523f9819c7a99755990d8ed6b08504',1,'cv::cudev::operator||(const double2 &a, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga093ad1e54e64a7cccf3782b2410172e3',1,'cv::cudev::operator||(const double4 &a, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3bb180e11c140a1860d1c7282f3f4c5',1,'cv::cudev::operator||(const double3 &a, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcd6bed19993a3dec96454714e056e3c',1,'cv::cudev::operator||(const uchar1 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8d59bf11b4243a05cd6cc3456fa3278',1,'cv::cudev::operator||(const uchar4 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga035765656c86485e88a7ffeedff10886',1,'cv::cudev::operator||(uchar s, const uchar4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c72b384daef54b49c99c95bb6e5d236',1,'cv::cudev::operator||(uchar s, const uchar2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac790b4177372769ebcb41bf113cc07d8',1,'cv::cudev::operator||(const uchar3 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444bdacd77a60792457a032271d6d8cc',1,'cv::cudev::operator||(uchar s, const uchar1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41de5b9e5a723be85cb439a1c08f7ce9',1,'cv::cudev::operator||(uchar s, const uchar3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5f81c65260b22ae9af48906f448382',1,'cv::cudev::operator||(const uchar2 &a, uchar s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28d8dab796f6cc5d9efbba9a4a140d4',1,'cv::cudev::operator||(char s, const char1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32f816f6e9ef55e8af7d1076b934d769',1,'cv::cudev::operator||(const char1 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae58e21e5c4f719ccbeff08445d7c6fdc',1,'cv::cudev::operator||(char s, const char4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57922b91c42d3f3ec0d95961bb252c2a',1,'cv::cudev::operator||(char s, const char3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bd2ec7511fa65af12e0c31e7eca6cf1',1,'cv::cudev::operator||(const char3 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad435bf12fa84bd6238bd536719b8a55d',1,'cv::cudev::operator||(const char4 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace641577e19ea3b0204727ec67a54b77',1,'cv::cudev::operator||(const char2 &a, char s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3ed13bdecfdf8509917b6128cbdd7b',1,'cv::cudev::operator||(char s, const char2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a42dd360c68ec429b3a9abd29792217',1,'cv::cudev::operator||(ushort s, const ushort2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62831716f60762daf6bdc34ba4563a5b',1,'cv::cudev::operator||(const ushort2 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eb7dc78006628d46caf362876324bfd',1,'cv::cudev::operator||(ushort s, const ushort4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95813948539b789f7529edc7fec1b313',1,'cv::cudev::operator||(const ushort3 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391980191d7c6907415884f3893e4622',1,'cv::cudev::operator||(ushort s, const ushort3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab52b978af7010683e959b7f5961f609c',1,'cv::cudev::operator||(const ushort1 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3c33ae535cb54e41e989a2e26834450',1,'cv::cudev::operator||(ushort s, const ushort1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed613e1f82f7862a55e3133e0b2ea94b',1,'cv::cudev::operator||(const ushort4 &a, ushort s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c9970228fa884a956021c0cebfe15e5',1,'cv::cudev::operator||(const short4 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc178b7c15f18971eb20fffbb9a887a7',1,'cv::cudev::operator||(short s, const short4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d5361965c51f7ca2fe416200eb560d7',1,'cv::cudev::operator||(const short3 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487430a598578322fad0872d8e6ea35',1,'cv::cudev::operator||(const short2 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f85d3d5f36760dd63779885fef347fc',1,'cv::cudev::operator||(const short1 &a, short s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0716b8368db9bfe6147ff620abcaf320',1,'cv::cudev::operator||(short s, const short1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3592b47fa7aa798a21f19a79a3a2d',1,'cv::cudev::operator||(short s, const short2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86fa4d24a51bc0fdb27624637e4162e7',1,'cv::cudev::operator||(short s, const short3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb7e65838ac0a9b1d7beac8bbf01b0e1',1,'cv::cudev::operator||(const int3 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9feff133da5c0cb798cc33b19fbd9ed2',1,'cv::cudev::operator||(const int1 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0995ff62918197fe40f2bea8e2b37898',1,'cv::cudev::operator||(int s, const int4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14791b0a2e98ba50d90b77b9d63768c3',1,'cv::cudev::operator||(int s, const int3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae3e389c0e99795f9a710bd9d7cd7893',1,'cv::cudev::operator||(int s, const int2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac554616aa3c8e0f521084e7fdffb3338',1,'cv::cudev::operator||(int s, const int1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e998efb0b51d4b11c8166bc17652e8f',1,'cv::cudev::operator||(const int2 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff58076f49066c7da5f88773b94eccca',1,'cv::cudev::operator||(const int4 &a, int s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa98a4d1808e3e161362ed3709ac3b76f',1,'cv::cudev::operator||(uint s, const uint4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630796daa4fa81bd3480cccdd6208ce0',1,'cv::cudev::operator||(const uint1 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1608d98a47346871d348ee3148a07c1a',1,'cv::cudev::operator||(uint s, const uint3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab756a072938395df21755c1b6a904d',1,'cv::cudev::operator||(const uint3 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff73a5437bdeffdeb0b0c679cf39443b',1,'cv::cudev::operator||(const uint4 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2b6b4c57ef47d6c51cc19656e57dc0',1,'cv::cudev::operator||(const uint2 &a, uint s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ae692a8fbb489bb9e1745d7065fa41f',1,'cv::cudev::operator||(uint s, const uint2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee77151b150eacdfbd738bbd951de91',1,'cv::cudev::operator||(uint s, const uint1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7bb01e03b921b536c9de83900f120cb',1,'cv::cudev::operator||(float s, const float4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb998884b15432012259b70ee9eff749',1,'cv::cudev::operator||(float s, const float1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6139801e245820e8d980eb9fa19227ae',1,'cv::cudev::operator||(const float4 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba01bc6fa2a85a61bc572ee53396c0d',1,'cv::cudev::operator||(const float2 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8dc5f6ba926a32a8bb43a71f974f71f3',1,'cv::cudev::operator||(float s, const float3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5cd0e8199aa6ece5c42b6d469df866d',1,'cv::cudev::operator||(const float3 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3283fe040cbd0280fae5affaa5a577c3',1,'cv::cudev::operator||(const float1 &a, float s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30c84efa97656970fb477d1ac42a077a',1,'cv::cudev::operator||(float s, const float2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae96a32168030467d5053c0f8bda7dd1b',1,'cv::cudev::operator||(const double3 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89385a5dbfdb1ef20b2e838ad9ec15cd',1,'cv::cudev::operator||(double s, const double2 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fafcbb93a3a84b83a0d2d4e0609100d',1,'cv::cudev::operator||(double s, const double3 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga848a2952f43a7226971f5d2426afbc8a',1,'cv::cudev::operator||(const double1 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf9201cd6a194985ee8dc16efad11954',1,'cv::cudev::operator||(const double4 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba6a7eed88b7ef37db22ace6732f6174',1,'cv::cudev::operator||(double s, const double1 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44648e106e79365765d8081617546291',1,'cv::cudev::operator||(double s, const double4 &b)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a03a718dffc89a29648a361f61ba315',1,'cv::cudev::operator||(const double2 &a, double s)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gade405ae7fba00188385f79da087b473d',1,'operator||(const Expr< Body > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga67336d4da1a1a0e097576e110e322d17',1,'operator||(const GlobPtrSz< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2d9325273f75ec46a5d0ccaa698dcab2',1,'operator||(const Expr< Body > &a, typename Body::value_type val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a350991d905802482a4a52516296256',1,'operator||(const Expr< Body > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafd38e92dca97e14285cb0a994eac2eb2',1,'operator||(const GlobPtrSz< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d1cf8719bfe35c1ce58b69439440ebb',1,'operator||(const GpuMat_< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga407966ca821a5b21a0fa3669273ce155',1,'operator||(const GlobPtrSz< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf3f1b3a6297712114fb1528180bf4d5d',1,'operator||(const Texture< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa60211ccc7148f580c9213f98d57d852',1,'operator||(const Texture< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6cc492c09a30238356c29f992f434bbb',1,'operator||(typename Body::value_type val, const Expr< Body > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab229fbb04aea1adaf4ad5a99495035b9',1,'operator||(const Texture< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac068c500d749dcf1c1b633a71343bf64',1,'operator||(const GpuMat_< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadfceb475fab9bf020cc18a7d00ce68fa',1,'operator||(const GpuMat_< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga970bfbba082e36b082ec64f178fa4bc4',1,'operator||(T val, const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga451cabb9165a8cb76c8b8281a48a74c3',1,'operator||(const Texture< T > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga7ed51988f3b066b935628ca0ca76c806',1,'operator||(T val, const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56be341fd82bc471dc3727ac767df94d',1,'operator||(const Expr< Body1 > &a, const Expr< Body2 > &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga43139046dc0327bc12a3405a63c93e78',1,'operator||(const GpuMat_< T > &src1, const Expr< Body > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga759c70e663c4ff4e8d2ae8217d47a7d7',1,'operator||(const Expr< Body > &src1, const GlobPtrSz< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga64af392441e02098f668b91b581d6158',1,'operator||(T val, const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9dfe768a49878db05bdb91ebe5a8759b',1,'operator||(const GlobPtrSz< T > &src1, const GpuMat_< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga292fb2e70406a170f98347e3d2110db8',1,'operator||(const Texture< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga20d93bcf778f16d1853957cc42ff9eab',1,'operator||(const GpuMat_< T > &src1, const Texture< T > &src2)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadce18a713dc4adf2e6fc8841b69a7639',1,'operator||(const GlobPtrSz< T > &src, T val)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf45510b81f8e1759112cecd4b5a4aa3',1,'operator||(const uchar3 &a, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5fe1c8b48957c39413aac5e3ffd90376',1,'operator||(const uchar1 &a, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1b56bd1f805e2cc2a433d784ea26764b',1,'operator||(const uchar4 &a, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga51f6411482c1c1dc459307997d262caa',1,'operator||(const uchar2 &a, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae01ca019d7b9f4b726b7017dccfb97eb',1,'operator||(const char2 &a, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2c9b224b12822bc42b33d5371cf7cef4',1,'operator||(const char1 &a, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabdb8f03f5e8aded2d1c1f5b674f8d0be',1,'operator||(const char3 &a, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga682b9e8e6d24725fbfd14afe04c746cc',1,'operator||(const char4 &a, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5f2c04274bc2e9ef0c0e64e835272570',1,'operator||(const ushort4 &a, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9613bf79ecb44e0124d987c0dc603c0e',1,'operator||(const ushort2 &a, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga96c371efcc9fa6314c3997cabac8de8e',1,'operator||(const ushort1 &a, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaebbcb4c326b4d6504cd9400ac933f53e',1,'operator||(const ushort3 &a, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa6a798890ec4e1c957610419cbc07fa3',1,'operator||(const short1 &a, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa0637cf031452de7f45462f4cf7d20f0',1,'operator||(const short4 &a, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3532b09926ae239bbfdcb638f8602895',1,'operator||(const short2 &a, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga625848bfaa38a86a0132a1771535fddb',1,'operator||(const short3 &a, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0c08c399ce28a20e5849c10236e3ec1e',1,'operator||(const int4 &a, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga446ac73d6fc9c701bf235f9530e05486',1,'operator||(const int1 &a, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1bdb1e714d4966bc3b89850c3f223aa6',1,'operator||(const int2 &a, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4d607a72c6d5edbf0c5f0defadeecfe9',1,'operator||(const int3 &a, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacc57b8d10acf24138375fc21e1799aeb',1,'operator||(const uint1 &a, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3b65fb035d930940ab0736ddbc0519fc',1,'operator||(const uint3 &a, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1593e87e954982987925c25988dab81a',1,'operator||(const uint4 &a, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5d0b4e24f07cae0bd5ef2032f1895b44',1,'operator||(const uint2 &a, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafb0588dab343533c00fe007f4e019f29',1,'operator||(const float4 &a, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7db7c5c12deeb79a3ad18e230fd0028',1,'operator||(const float2 &a, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga99d4f17ca75885550288386f0959cfa5',1,'operator||(const float3 &a, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga56bd222aa931f4a2f6c330e6e49ed71c',1,'operator||(const float1 &a, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga53fea0cb9bdf3c6ad83ef37fe04f24dc',1,'operator||(const double1 &a, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6c523f9819c7a99755990d8ed6b08504',1,'operator||(const double2 &a, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga093ad1e54e64a7cccf3782b2410172e3',1,'operator||(const double4 &a, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3bb180e11c140a1860d1c7282f3f4c5',1,'operator||(const double3 &a, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafcd6bed19993a3dec96454714e056e3c',1,'operator||(const uchar1 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8d59bf11b4243a05cd6cc3456fa3278',1,'operator||(const uchar4 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga035765656c86485e88a7ffeedff10886',1,'operator||(uchar s, const uchar4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3c72b384daef54b49c99c95bb6e5d236',1,'operator||(uchar s, const uchar2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac790b4177372769ebcb41bf113cc07d8',1,'operator||(const uchar3 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga444bdacd77a60792457a032271d6d8cc',1,'operator||(uchar s, const uchar1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga41de5b9e5a723be85cb439a1c08f7ce9',1,'operator||(uchar s, const uchar3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb5f81c65260b22ae9af48906f448382',1,'operator||(const uchar2 &a, uchar s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab28d8dab796f6cc5d9efbba9a4a140d4',1,'operator||(char s, const char1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga32f816f6e9ef55e8af7d1076b934d769',1,'operator||(const char1 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae58e21e5c4f719ccbeff08445d7c6fdc',1,'operator||(char s, const char4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga57922b91c42d3f3ec0d95961bb252c2a',1,'operator||(char s, const char3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bd2ec7511fa65af12e0c31e7eca6cf1',1,'operator||(const char3 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad435bf12fa84bd6238bd536719b8a55d',1,'operator||(const char4 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gace641577e19ea3b0204727ec67a54b77',1,'operator||(const char2 &a, char s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gabf3ed13bdecfdf8509917b6128cbdd7b',1,'operator||(char s, const char2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8a42dd360c68ec429b3a9abd29792217',1,'operator||(ushort s, const ushort2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga62831716f60762daf6bdc34ba4563a5b',1,'operator||(const ushort2 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1eb7dc78006628d46caf362876324bfd',1,'operator||(ushort s, const ushort4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga95813948539b789f7529edc7fec1b313',1,'operator||(const ushort3 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga391980191d7c6907415884f3893e4622',1,'operator||(ushort s, const ushort3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab52b978af7010683e959b7f5961f609c',1,'operator||(const ushort1 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa3c33ae535cb54e41e989a2e26834450',1,'operator||(ushort s, const ushort1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaed613e1f82f7862a55e3133e0b2ea94b',1,'operator||(const ushort4 &a, ushort s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8c9970228fa884a956021c0cebfe15e5',1,'operator||(const short4 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafc178b7c15f18971eb20fffbb9a887a7',1,'operator||(short s, const short4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3d5361965c51f7ca2fe416200eb560d7',1,'operator||(const short3 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8487430a598578322fad0872d8e6ea35',1,'operator||(const short2 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3f85d3d5f36760dd63779885fef347fc',1,'operator||(const short1 &a, short s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0716b8368db9bfe6147ff620abcaf320',1,'operator||(short s, const short1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4fd3592b47fa7aa798a21f19a79a3a2d',1,'operator||(short s, const short2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga86fa4d24a51bc0fdb27624637e4162e7',1,'operator||(short s, const short3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadb7e65838ac0a9b1d7beac8bbf01b0e1',1,'operator||(const int3 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9feff133da5c0cb798cc33b19fbd9ed2',1,'operator||(const int1 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga0995ff62918197fe40f2bea8e2b37898',1,'operator||(int s, const int4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga14791b0a2e98ba50d90b77b9d63768c3',1,'operator||(int s, const int3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaae3e389c0e99795f9a710bd9d7cd7893',1,'operator||(int s, const int2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac554616aa3c8e0f521084e7fdffb3338',1,'operator||(int s, const int1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1e998efb0b51d4b11c8166bc17652e8f',1,'operator||(const int2 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff58076f49066c7da5f88773b94eccca',1,'operator||(const int4 &a, int s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa98a4d1808e3e161362ed3709ac3b76f',1,'operator||(uint s, const uint4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga630796daa4fa81bd3480cccdd6208ce0',1,'operator||(const uint1 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1608d98a47346871d348ee3148a07c1a',1,'operator||(uint s, const uint3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaab756a072938395df21755c1b6a904d',1,'operator||(const uint3 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaff73a5437bdeffdeb0b0c679cf39443b',1,'operator||(const uint4 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4c2b6b4c57ef47d6c51cc19656e57dc0',1,'operator||(const uint2 &a, uint s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga1ae692a8fbb489bb9e1745d7065fa41f',1,'operator||(uint s, const uint2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadee77151b150eacdfbd738bbd951de91',1,'operator||(uint s, const uint1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gad7bb01e03b921b536c9de83900f120cb',1,'operator||(float s, const float4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacb998884b15432012259b70ee9eff749',1,'operator||(float s, const float1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6139801e245820e8d980eb9fa19227ae',1,'operator||(const float4 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaba01bc6fa2a85a61bc572ee53396c0d',1,'operator||(const float2 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga8dc5f6ba926a32a8bb43a71f974f71f3',1,'operator||(float s, const float3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf5cd0e8199aa6ece5c42b6d469df866d',1,'operator||(const float3 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3283fe040cbd0280fae5affaa5a577c3',1,'operator||(const float1 &a, float s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30c84efa97656970fb477d1ac42a077a',1,'operator||(float s, const float2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gae96a32168030467d5053c0f8bda7dd1b',1,'operator||(const double3 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga89385a5dbfdb1ef20b2e838ad9ec15cd',1,'operator||(double s, const double2 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3fafcbb93a3a84b83a0d2d4e0609100d',1,'operator||(double s, const double3 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga848a2952f43a7226971f5d2426afbc8a',1,'operator||(const double1 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gacf9201cd6a194985ee8dc16efad11954',1,'operator||(const double4 &a, double s)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaba6a7eed88b7ef37db22ace6732f6174',1,'operator||(double s, const double1 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga44648e106e79365765d8081617546291',1,'operator||(double s, const double4 &b)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4a03a718dffc89a29648a361f61ba315',1,'operator||(const double2 &a, double s)(Global Namespace)']]], + ['operator_7e_136',['operator~',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69ba8f5d451de974d9aa514cdbbb1120',1,'cv::MatExpr::operator~(const Mat &m)'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a69ba8f5d451de974d9aa514cdbbb1120',1,'cv::MatExpr::operator~(const Mat &m)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01823.html#a2cdeed3169c5dbfd617f68bbef6457ee',1,'std::bitset::operator~()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09787.html#aed8f061579e182d2d8249f37a11de6c4',1,'std::tr2::dynamic_bitset::operator~()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga88b2ec0fbd1864a99c09d24f5b39e16d',1,'std::valarray::operator~()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga88b2ec0fbd1864a99c09d24f5b39e16d',1,'valarray< size_t >::operator~()'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6238e30480f4a52f3b30d5c21bbbadb1',1,'cv::operator~()'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf198524c2b506a2c29566cf7c9ae5e19',1,'cv::cudev::operator~(const Expr< Body > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf5b7bc46f1c4ffac38c938fdbea0d16',1,'cv::cudev::operator~(const GlobPtrSz< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4618266096d4f1e47a4cd6967fb84fc3',1,'cv::cudev::operator~(const Texture< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8deb59fd638ca954bbdaf55f76a897',1,'cv::cudev::operator~(const GpuMat_< T > &src)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3055d07443d2275c1d12b97bdf297fce',1,'cv::cudev::operator~(const uchar1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c754a9105964639a463dadebfa4176',1,'cv::cudev::operator~(const uchar4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d4f587e0787e85c7237f061c7f5629',1,'cv::cudev::operator~(const uchar2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77e7214b716a6e24b6c0ad5100723acb',1,'cv::cudev::operator~(const uchar3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa20f0d48b258a29f1f78dc3bcd155f2',1,'cv::cudev::operator~(const char3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bb7b251d40b57f97ee8761816827d5f',1,'cv::cudev::operator~(const char2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cca9e55f0124be8c28f031dde68ff82',1,'cv::cudev::operator~(const char4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga838e1acadd4adf72d05375901877406a',1,'cv::cudev::operator~(const char1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8c1a39515d09b32e3d25441c5cd129a',1,'cv::cudev::operator~(const ushort2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf372f82a0e3f18ff74490509c8fb3600',1,'cv::cudev::operator~(const ushort1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga077d19d04f77129e7fdb284d42bc78ee',1,'cv::cudev::operator~(const ushort3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa789cd510fcff4984885dcdfbb618018',1,'cv::cudev::operator~(const ushort4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7d9565b8e27201dbcefa113a9c16c8',1,'cv::cudev::operator~(const short4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga861b8704201b4e6e2d55a9abd798161a',1,'cv::cudev::operator~(const short2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195352c298ca60f9f1427d993b5aeb6c',1,'cv::cudev::operator~(const short3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa4e3b79d78611d2031c8d21420d4ab',1,'cv::cudev::operator~(const short1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133c3fb71ea8172a37867390be557400',1,'cv::cudev::operator~(const int4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7d6682dd37b7ea68625ab7a1b693926',1,'cv::cudev::operator~(const int2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9cb1d6029d987bdbd57fb47193ee591',1,'cv::cudev::operator~(const int1 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1e50a02cb728d3a0a936c6239263d0',1,'cv::cudev::operator~(const int3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79cc15f84516fa21851f6c9748497891',1,'cv::cudev::operator~(const uint3 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37a2be39fcfb682e1e91697df152cdd3',1,'cv::cudev::operator~(const uint4 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8e1f246e66d56a7a4315f926d64938e',1,'cv::cudev::operator~(const uint2 &a)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecbd81337a2a8039c93dc0f6b7f322d4',1,'cv::cudev::operator~(const uint1 &a)'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga6238e30480f4a52f3b30d5c21bbbadb1',1,'operator~(const v_reg< _Tp, n > &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf198524c2b506a2c29566cf7c9ae5e19',1,'operator~(const Expr< Body > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaaf5b7bc46f1c4ffac38c938fdbea0d16',1,'operator~(const GlobPtrSz< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga4618266096d4f1e47a4cd6967fb84fc3',1,'operator~(const Texture< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gadf8deb59fd638ca954bbdaf55f76a897',1,'operator~(const GpuMat_< T > &src)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga3055d07443d2275c1d12b97bdf297fce',1,'operator~(const uchar1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga46c754a9105964639a463dadebfa4176',1,'operator~(const uchar4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga30d4f587e0787e85c7237f061c7f5629',1,'operator~(const uchar2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga77e7214b716a6e24b6c0ad5100723acb',1,'operator~(const uchar3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gafa20f0d48b258a29f1f78dc3bcd155f2',1,'operator~(const char3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga2bb7b251d40b57f97ee8761816827d5f',1,'operator~(const char2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga5cca9e55f0124be8c28f031dde68ff82',1,'operator~(const char4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga838e1acadd4adf72d05375901877406a',1,'operator~(const char1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8c1a39515d09b32e3d25441c5cd129a',1,'operator~(const ushort2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaf372f82a0e3f18ff74490509c8fb3600',1,'operator~(const ushort1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga077d19d04f77129e7fdb284d42bc78ee',1,'operator~(const ushort3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa789cd510fcff4984885dcdfbb618018',1,'operator~(const ushort4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaca7d9565b8e27201dbcefa113a9c16c8',1,'operator~(const short4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga861b8704201b4e6e2d55a9abd798161a',1,'operator~(const short2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga195352c298ca60f9f1427d993b5aeb6c',1,'operator~(const short3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga9aa4e3b79d78611d2031c8d21420d4ab',1,'operator~(const short1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga133c3fb71ea8172a37867390be557400',1,'operator~(const int4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gac7d6682dd37b7ea68625ab7a1b693926',1,'operator~(const int2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaa9cb1d6029d987bdbd57fb47193ee591',1,'operator~(const int1 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga6b1e50a02cb728d3a0a936c6239263d0',1,'operator~(const int3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga79cc15f84516fa21851f6c9748497891',1,'operator~(const uint3 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#ga37a2be39fcfb682e1e91697df152cdd3',1,'operator~(const uint4 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gab8e1f246e66d56a7a4315f926d64938e',1,'operator~(const uint2 &a)(Global Namespace)'],['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html#gaecbd81337a2a8039c93dc0f6b7f322d4',1,'operator~(const uint1 &a)(Global Namespace)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#ad3de70b7c5c74267276903c86628e239',1,'std::regex_constants::operator~(syntax_option_type __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a2aeb16521b6691e19cb344505b084271',1,'std::regex_constants::operator~(match_flag_type __a)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html#ga88b2ec0fbd1864a99c09d24f5b39e16d',1,'operator~()(Global Namespace)']]], + ['oplandiplparvoparameters_137',['OPLandIplParvoParameters',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#a397e52e1f6738f907169910800c6aae7',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], + ['optflowestimator_138',['optFlowEstimator',['https://docs.opencv.org/4.2.0/da/d37/classcv_1_1videostab_1_1MotionInpainter.html#a2febcdca26690c112002949348ade823',1,'cv::videostab::MotionInpainter']]], + ['opticalflowestimator_139',['opticalFlowEstimator',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a490cd8c016f7b4d181daedb55eec28e9',1,'cv::videostab::KeypointBasedMotionEstimator']]], + ['opticalflowpcaflow_140',['OpticalFlowPCAFlow',['https://docs.opencv.org/4.2.0/d1/da2/classcv_1_1optflow_1_1OpticalFlowPCAFlow.html#afe6dd4b33d08e519a8ef2d0798564040',1,'cv::optflow::OpticalFlowPCAFlow']]], + ['optimizeextrinsics_141',['optimizeExtrinsics',['https://docs.opencv.org/4.2.0/d4/dc7/classcv_1_1multicalib_1_1MultiCameraCalibration.html#ac4c4d52808b8878e134c22c09e0b5717',1,'cv::multicalib::MultiCameraCalibration']]], + ['optional_142',['optional',['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#ab22465abe81369037764c6ac1b799273',1,'cv::util::optional::optional()'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a09eaedc3d5761ccc237a213e6f4f8d94',1,'cv::util::optional::optional(const optional &)=default'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#aad5e2bf28fd67eac2c683e189d25f9e0',1,'cv::util::optional::optional(T &&value) noexcept'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#a63127f3a74565eec28548a24e18c2716',1,'cv::util::optional::optional(const T &value) noexcept'],['https://docs.opencv.org/4.2.0/d1/dec/classcv_1_1util_1_1optional.html#ab7e3745f571967e65d36bc7eeb640d7f',1,'cv::util::optional::optional(optional &&) noexcept']]], + ['optional_5flock_5fguard_143',['optional_lock_guard',['https://docs.opencv.org/4.2.0/d3/de8/classcv_1_1utils_1_1optional__lock__guard.html#a8a7a28c1f9a4153a89b806ce065106e1',1,'cv::utils::optional_lock_guard']]], + ['optional_5fshared_5flock_5fguard_144',['optional_shared_lock_guard',['https://docs.opencv.org/4.2.0/d2/ddd/classcv_1_1utils_1_1optional__shared__lock__guard.html#a87856795a393a792d0588da931a6f6d6',1,'cv::utils::optional_shared_lock_guard']]], + ['options_145',['options',['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a42d9d79073379f1e75b0f2c49879ed5b',1,'Eigen::SuperLUBase::options()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a42d9d79073379f1e75b0f2c49879ed5b',1,'SuperLUBase< _MatrixType, SuperILU< _MatrixType > >::options()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SuperLUBase.html#a42d9d79073379f1e75b0f2c49879ed5b',1,'SuperLUBase< _MatrixType, SuperLU< _MatrixType > >::options()']]], + ['or8u_146',['or8u',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabe8e8d763760f73eb41f9b555b92a6a3',1,'cv::hal::or8u()'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html#gabe8e8d763760f73eb41f9b555b92a6a3',1,'or8u()(Global Namespace)']]], + ['orange_147',['orange',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a1a1069a4fd84db013399ffc68c202901',1,'cv::viz::Color']]], + ['orange_5fred_148',['orange_red',['https://docs.opencv.org/4.2.0/d4/dba/classcv_1_1viz_1_1Color.html#a6d78c79310b79a16fd8100b80d50aeef',1,'cv::viz::Color']]], + ['order_5fof_5fkey_149',['order_of_key',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11359.html#a1c33a80afedc268c76b5ad8468fb84ee',1,'__gnu_pbds::tree_order_statistics_node_update::order_of_key()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#afc18e57812078123f3fb91a1148ec5f5',1,'__gnu_pbds::trie_order_statistics_node_update::order_of_key(key_const_reference) const']]], + ['order_5fof_5fprefix_150',['order_of_prefix',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11371.html#a5baafac1f227b055faf0f836ccf166fc',1,'__gnu_pbds::trie_order_statistics_node_update']]], + ['ordered_5fmap_151',['ordered_map',['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a87938c10b76510dac00412d2cb5fd1e4.html#a87938c10b76510dac00412d2cb5fd1e4',1,'nlohmann::ordered_map::ordered_map(const Allocator &alloc=Allocator())'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a9d25efb51325cc1be027b8ea00c1f8b8.html#a9d25efb51325cc1be027b8ea00c1f8b8',1,'nlohmann::ordered_map::ordered_map(It first, It last, const Allocator &alloc=Allocator())'],['https://nlohmann.github.io/json/doxygen/structnlohmann_1_1ordered__map_a0482ea79e7786367a2d9b5c789c091ce.html#a0482ea79e7786367a2d9b5c789c091ce',1,'nlohmann::ordered_map::ordered_map(std::initializer_list< T > init, const Allocator &alloc=Allocator())']]], + ['ostream_5fiterator_152',['ostream_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a43b5a82905d5237921fc78c44455950a',1,'std::ostream_iterator::ostream_iterator(ostream_type &__s)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#afa776b7965fc2d27f9281944542be2d8',1,'std::ostream_iterator::ostream_iterator(ostream_type &__s, const _CharT *__c)'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07979.html#a6f93dbe2e9972260dd0ab4b869967e26',1,'std::ostream_iterator::ostream_iterator(const ostream_iterator &__obj)']]], + ['ostreambuf_5fiterator_153',['ostreambuf_iterator',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#ac9080f23edb16ede8dc2e24e84f75207',1,'std::ostreambuf_iterator::ostreambuf_iterator(ostream_type &__s) noexcept'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02487.html#aef4876e87478fee9493302260f2c1b36',1,'std::ostreambuf_iterator::ostreambuf_iterator(streambuf_type *__s) noexcept']]], + ['out_154',['out',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< _InternT, _ExternT, encoding_state >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< char, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< char16_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< char32_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'__codecvt_abstract_base< wchar_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'codecvt< _Elem, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::__codecvt_abstract_base::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< _InternT, _ExternT, encoding_state >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< char, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< char16_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< char32_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt< wchar_t, char, mbstate_t >::out()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05195.html#a3a2b1f2da1bc0d89ccd1eceaa66bb79f',1,'std::codecvt_byname::out()']]], + ['outer_155',['outer',['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Eigen::Stride::outer()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Stride< 0, Value >::outer()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Stride< StrideType::OuterStrideAtCompileTime, StrideType::InnerStrideAtCompileTime >::outer()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1Stride.html#a010ffe25388932a6c83c6d9d95b95442',1,'Stride< Value, 0 >::outer()']]], + ['outerindexptr_156',['outerIndexPtr',['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'Eigen::SparseCompressedBase::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'Eigen::SparseCompressedBase::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Block< const SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Block< SparseMatrix< _Scalar, _Options, _StorageIndex >, BlockRows, BlockCols, true > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Block< SparseMatrixType, BlockRows, BlockCols, true > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Derived >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Derived >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< _Scalar, _Options, _StorageIndex > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, _StorageIndex > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, int > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< SparseMatrix< Scalar, _Options, StorageIndex > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1d2602a8c30f924857be54ff6de5f47e',1,'SparseCompressedBase< Transpose< MatrixType > >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseCompressedBase.html#a1f41e3360fd9f0c749686c6ffb829a90',1,'SparseCompressedBase< Transpose< MatrixType > >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a24c55dd8de4aca30e7c90b69aa5dca6b',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01WriteAccessors_01_4.html#a3b74af754254837fc591cd9936688b95',1,'Eigen::SparseMapBase< Derived, WriteAccessors >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'Eigen::SparseMatrix::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'Eigen::SparseMatrix::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar, ColMajor, int >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar, ColMajor, int >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::outerIndexPtr() const'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a9451af2795c1a5b97678272475e41422',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::outerIndexPtr()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a75506964d86d6badb32d0b4917acf2e2',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::outerIndexPtr() const']]], + ['outersize_157',['outerSize',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'Eigen::DenseBase::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'DenseBase< ArrayWrapper< ExpressionType > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a03f71699bc26ca2ee4e42ec4538862d7',1,'DenseBase< Solve< Decomposition, RhsType > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMapBase_3_01Derived_00_01ReadOnlyAccessors_01_4.html#a3d6ede19db6d42074ae063bc876231b1',1,'Eigen::SparseMapBase< Derived, ReadOnlyAccessors >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'Eigen::SparseMatrix::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar, ColMajor, int >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar, ColMajor, StorageIndex >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrix.html#a4e5f706cfae14d2eaec1ea1e234905f1',1,'SparseMatrix< Scalar, RowMajor, StorageIndex >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'Eigen::SparseMatrixBase::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< Transpose< MatrixType > >::outerSize()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#ac86cc88a4cfef21db6b64ec0ab4c8f0a',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::outerSize()']]], + ['outerstride_158',['outerStride',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectAccessors_01_4.html#ad88c60c4a2356be2c436f3264dd20b55',1,'Eigen::DenseCoeffsBase< Derived, DirectAccessors >::outerStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseCoeffsBase_3_01Derived_00_01DirectWriteAccessors_01_4.html#abb333f6f10467f6f8d7b59c213dea49e',1,'Eigen::DenseCoeffsBase< Derived, DirectWriteAccessors >::outerStride()'],['https://eigen.tuxfamily.org/dox/classEigen_1_1TriangularViewImpl_3_01__MatrixType_00_01__Mode_00_01Dense_01_4.html#afe47788156e483b9025ab320cc7f925e',1,'Eigen::TriangularViewImpl< _MatrixType, _Mode, Dense >::outerStride()']]], + ['outlierrejector_159',['outlierRejector',['https://docs.opencv.org/4.2.0/d5/dec/classcv_1_1videostab_1_1KeypointBasedMotionEstimator.html#a1c7ec46d4913af1d422b6accb67ddfed',1,'cv::videostab::KeypointBasedMotionEstimator']]], + ['outline_160',['OutLine',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a436e4b941c3da68fae821ed5786620b3',1,'cv::gapi::fluid::Buffer']]], + ['outlineb_161',['OutLineB',['https://docs.opencv.org/4.2.0/dc/d92/classcv_1_1gapi_1_1fluid_1_1Buffer.html#a875c6cfa0315fbb9e1aa94153d7af378',1,'cv::gapi::fluid::Buffer']]], + ['outmatr_162',['outMatR',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#a271dfd3a4a49c4900165991414fc5342',1,'cv::GCPUContext::outMatR()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#ab6561a2ea00141e38ac8afa1f89458ab',1,'cv::GOCLContext::outMatR()']]], + ['outmetas_163',['outMetas',['https://docs.opencv.org/4.2.0/d2/d2c/classcv_1_1GCompiled.html#adb1e2c45cc469afe7aa98d5500aac1a4',1,'cv::GCompiled::outMetas()'],['https://docs.opencv.org/4.2.0/d1/d9b/classcv_1_1GStreamingCompiled.html#ac9961bb29f6e049fcda55384877b8bb5',1,'cv::GStreamingCompiled::outMetas()']]], + ['output_164',['Output',['../classfilters_1_1Output.html#a48acc7be07c07f2336679a1d81a1f0e4',1,'filters::Output']]], + ['outputfuncjacobianv_165',['outputFuncJacobianV',['../classfilters_1_1Output.html#ad993de846ff252efb8bb22c99805b508',1,'filters::Output']]], + ['outputfuncjacobianx_166',['outputFuncJacobianX',['../classfilters_1_1Output.html#a5c42af319c18c623e92f92a70b3d0580',1,'filters::Output']]], + ['outputnametoindex_167',['outputNameToIndex',['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a60ffc8238f3fa26cd3f49daa7ac0884b',1,'cv::dnn::Layer::outputNameToIndex()'],['https://docs.opencv.org/4.2.0/db/d3e/classcv_1_1dnn_1_1LSTMLayer.html#a275295575f6b1a7b5c68d414bf7530aa',1,'cv::dnn::LSTMLayer::outputNameToIndex()']]], + ['outtensor_168',['outTensor',['https://docs.opencv.org/4.2.0/de/d5f/structcv_1_1GPlaidMLContext.html#a1e1172f28b455bf4ed59e22c836e35f2',1,'cv::GPlaidMLContext']]], + ['outvalr_169',['outValR',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#a85b0ee69ff748139aabb7f94c62cc6f3',1,'cv::GCPUContext::outValR()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#ad61c8d7c7df84b5efef5db7527560cb4',1,'cv::GOCLContext::outValR()']]], + ['outvecr_170',['outVecR',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#ac63c2703e6f4e7ae1c6cf77607a4ef31',1,'cv::GCPUContext::outVecR()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a23b6577922d9c1b5b3bb835c16e76afa',1,'cv::GOCLContext::outVecR()']]], + ['outvecref_171',['outVecRef',['https://docs.opencv.org/4.2.0/d4/dc1/classcv_1_1GCPUContext.html#aae9072800907251490f88444df8f8558',1,'cv::GCPUContext::outVecRef()'],['https://docs.opencv.org/4.2.0/d7/da9/classcv_1_1GOCLContext.html#a0f5085f10ef2311591f023eedd0a0a49',1,'cv::GOCLContext::outVecRef()']]], + ['overflow_172',['overflow',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'__gnu_cxx::enc_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'__gnu_cxx::stdio_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'__gnu_cxx::stdio_sync_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_filebuf< _CharT, encoding_char_traits< _CharT > >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_filebuf< char_type, traits_type >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_streambuf< _Elem, _Tr >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_streambuf< char, _Traits >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'basic_streambuf< char, char_traits< char > >::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::basic_filebuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::basic_streambuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::basic_stringbuf::overflow()'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a02451.html#a4e7aec20e76936e17df779db22877b19',1,'std::wbuffer_convert::overflow()']]], + ['overlap_173',['overlap',['https://docs.opencv.org/4.2.0/d2/d29/classcv_1_1KeyPoint.html#a6a56a625fb5fb0df7c63c69ce7713360',1,'cv::KeyPoint']]], + ['overlaproi_174',['overlapRoi',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gaf9ff38a39051369119b53529b3d779ab',1,'cv::detail::overlapRoi()'],['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html#gaf9ff38a39051369119b53529b3d779ab',1,'overlapRoi()(Global Namespace)']]] ]; diff --git a/search/groups_10.js b/search/groups_10.js index 8584e992..504d0e2b 100644 --- a/search/groups_10.js +++ b/search/groups_10.js @@ -21,48 +21,46 @@ var searchData= ['math_20with_20f1_20transform_20support_18',['Math with F1-transform support',['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html',1,'']]], ['mathematical_20special_20functions_19',['Mathematical Special Functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html',1,'Mathematical Special Functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html',1,'Mathematical Special Functions']]], ['mathematics_20',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], - ['matrices_21',['Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'Arithm Operations on Matrices'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'Core Operations on Matrices']]], - ['matrices_22',['Graph API: Operations on matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'']]], - ['matrices_23',['Operations on Matrices',['https://docs.opencv.org/4.2.0/d5/d8e/group__cudaarithm.html',1,'']]], - ['matrices_24',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], - ['matrix_20and_20array_20manipulation_25',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], - ['matrix_20and_20vector_20arithmetic_26',['Matrix and vector arithmetic',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixArithmetic.html',1,'']]], - ['matrix_20class_27',['The Matrix class',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixClass.html',1,'']]], - ['matrix_20decomposition_28',['matrix decomposition',['https://docs.opencv.org/4.2.0/d8/d0e/group__core__hal__interface__decomp__cholesky.html',1,'Cholesky matrix decomposition'],['https://docs.opencv.org/4.2.0/d5/d42/group__core__hal__interface__decomp__lu.html',1,'LU matrix decomposition'],['https://docs.opencv.org/4.2.0/db/d36/group__core__hal__interface__decomp__qr.html',1,'QR matrix decomposition'],['https://docs.opencv.org/4.2.0/dd/d2a/group__core__hal__interface__decomp__svd.html',1,'Singular value matrix decomposition']]], - ['matrix_20decompositions_29',['Inplace matrix decompositions',['https://eigen.tuxfamily.org/dox/group__InplaceDecomposition.html',1,'']]], - ['matrix_20free_20solvers_30',['Matrix-free solvers',['https://eigen.tuxfamily.org/dox/group__MatrixfreeSolverExample.html',1,'']]], - ['matrix_20manipulations_31',['Sparse matrix manipulations',['https://eigen.tuxfamily.org/dox/group__TutorialSparse.html',1,'']]], - ['matrix_20multiplication_32',['Matrix multiplication',['https://docs.opencv.org/4.2.0/d2/dab/group__core__hal__interface__matrix__multiplication.html',1,'']]], - ['matrix_20reductions_33',['Matrix Reductions',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html',1,'']]], - ['matrix_20typedefs_34',['Global matrix typedefs',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html',1,'']]], - ['maximum_35',['Element-wise minimum or maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'']]], - ['members_36',['Adaptors for pointers to members',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01511.html',1,'']]], - ['members_37',['Structures Having Eigen Members',['https://eigen.tuxfamily.org/dox/group__TopicStructHavingEigenMembers.html',1,'']]], - ['memory_38',['Memory',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01480.html',1,'']]], - ['merge_39',['Channel merge',['https://docs.opencv.org/4.2.0/df/d2e/group__core__hal__interface__merge.html',1,'']]], - ['meta_20module_40',['Sparse meta-module',['https://eigen.tuxfamily.org/dox/group__Sparse__Module.html',1,'']]], - ['metadata_20descriptors_41',['G-API Metadata Descriptors',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html',1,'']]], - ['metaprogramming_42',['Metaprogramming',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html',1,'']]], - ['method_43',['Fast Marching Method',['https://docs.opencv.org/4.2.0/db/d18/group__videostab__marching.html',1,'']]], - ['methods_44',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], - ['metissupport_20module_45',['MetisSupport module',['https://eigen.tuxfamily.org/dox/group__MetisSupport__Module.html',1,'']]], - ['minimum_20or_20maximum_46',['Element-wise minimum or maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'']]], - ['miscellaneous_20image_20transformations_47',['Miscellaneous Image Transformations',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html',1,'']]], - ['model_48',['Fisheye camera model',['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html',1,'']]], - ['models_49',['Deformable Part-based Models',['https://docs.opencv.org/4.2.0/d9/d12/group__dpm.html',1,'']]], - ['models_20and_20derivated_20tools_50',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], - ['module_51',['module',['https://eigen.tuxfamily.org/dox/group__Cholesky__Module.html',1,'Cholesky module'],['https://eigen.tuxfamily.org/dox/group__CholmodSupport__Module.html',1,'CholmodSupport module'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html',1,'Core module'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html',1,'Deep Neural Network module'],['https://eigen.tuxfamily.org/dox/group__Eigenvalues__Module.html',1,'Eigenvalues module'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html',1,'Geometry module'],['https://eigen.tuxfamily.org/dox/group__Householder__Module.html',1,'Householder module'],['https://eigen.tuxfamily.org/dox/group__IterativeLinearSolvers__Module.html',1,'IterativeLinearSolvers module'],['https://eigen.tuxfamily.org/dox/group__Jacobi__Module.html',1,'Jacobi module'],['https://eigen.tuxfamily.org/dox/group__KLUSupport__Module.html',1,'KLUSupport module'],['https://eigen.tuxfamily.org/dox/group__LU__Module.html',1,'LU module'],['https://eigen.tuxfamily.org/dox/group__MetisSupport__Module.html',1,'MetisSupport module'],['https://eigen.tuxfamily.org/dox/group__OrderingMethods__Module.html',1,'OrderingMethods module'],['https://eigen.tuxfamily.org/dox/group__PardisoSupport__Module.html',1,'PardisoSupport module'],['https://eigen.tuxfamily.org/dox/group__PaStiXSupport__Module.html',1,'PaStiXSupport module'],['https://eigen.tuxfamily.org/dox/group__QR__Module.html',1,'QR module'],['https://eigen.tuxfamily.org/dox/group__Sparse__Module.html',1,'Sparse meta-module'],['https://eigen.tuxfamily.org/dox/group__SparseCholesky__Module.html',1,'SparseCholesky module'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html',1,'SparseCore module'],['https://eigen.tuxfamily.org/dox/group__SparseLU__Module.html',1,'SparseLU module'],['https://eigen.tuxfamily.org/dox/group__SparseQR__Module.html',1,'SparseQR module'],['https://eigen.tuxfamily.org/dox/group__SPQRSupport__Module.html',1,'SuiteSparseQR module'],['https://eigen.tuxfamily.org/dox/group__SuperLUSupport__Module.html',1,'SuperLUSupport module'],['https://eigen.tuxfamily.org/dox/group__SVD__Module.html',1,'SVD module'],['https://eigen.tuxfamily.org/dox/group__UmfPackSupport__Module.html',1,'UmfPackSupport module']]], - ['module_20brings_20implementations_20of_20different_20image_20hashing_20algorithms_52',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], - ['modules_53',['Support modules',['https://eigen.tuxfamily.org/dox/group__Support__modules.html',1,'']]], - ['morphology_20on_20run_20length_20encoded_20image_54',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], - ['motion_55',['Structure From Motion',['https://docs.opencv.org/4.2.0/d8/d8c/group__sfm.html',1,'']]], - ['motion_20analysis_56',['Motion Analysis',['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html',1,'']]], - ['motion_20analysis_20and_20object_20tracking_57',['Motion Analysis and Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'']]], - ['motion_20estimation_58',['Global Motion Estimation',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html',1,'']]], - ['multi_20dimensional_20spaces_59',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], - ['multiplication_60',['Matrix multiplication',['https://docs.opencv.org/4.2.0/d2/dab/group__core__hal__interface__matrix__multiplication.html',1,'']]], - ['multiply_61',['Element-wise multiply',['https://docs.opencv.org/4.2.0/de/db7/group__core__hal__interface__multiply.html',1,'']]], - ['multiview_20stereo_20matching_62',['Multiview Stereo Matching',['https://docs.opencv.org/4.2.0/d7/dd5/group__datasets__msm.html',1,'']]], - ['mutating_63',['Mutating',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html',1,'Mutating'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html',1,'Non-Mutating']]], - ['mutexes_64',['Mutexes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html',1,'']]] + ['matrices_21',['Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'Arithm Operations on Matrices'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'Core Operations on Matrices'],['https://docs.opencv.org/4.2.0/d5/d8e/group__cudaarithm.html',1,'Operations on Matrices']]], + ['matrices_22',['matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'Graph API: Operations on matrices'],['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'Quick reference guide for sparse matrices']]], + ['matrix_20and_20array_20manipulation_23',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], + ['matrix_20and_20vector_20arithmetic_24',['Matrix and vector arithmetic',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixArithmetic.html',1,'']]], + ['matrix_20class_25',['The Matrix class',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixClass.html',1,'']]], + ['matrix_20decomposition_26',['matrix decomposition',['https://docs.opencv.org/4.2.0/d8/d0e/group__core__hal__interface__decomp__cholesky.html',1,'Cholesky matrix decomposition'],['https://docs.opencv.org/4.2.0/d5/d42/group__core__hal__interface__decomp__lu.html',1,'LU matrix decomposition'],['https://docs.opencv.org/4.2.0/db/d36/group__core__hal__interface__decomp__qr.html',1,'QR matrix decomposition'],['https://docs.opencv.org/4.2.0/dd/d2a/group__core__hal__interface__decomp__svd.html',1,'Singular value matrix decomposition']]], + ['matrix_20decompositions_27',['Inplace matrix decompositions',['https://eigen.tuxfamily.org/dox/group__InplaceDecomposition.html',1,'']]], + ['matrix_20free_20solvers_28',['Matrix-free solvers',['https://eigen.tuxfamily.org/dox/group__MatrixfreeSolverExample.html',1,'']]], + ['matrix_20manipulations_29',['Sparse matrix manipulations',['https://eigen.tuxfamily.org/dox/group__TutorialSparse.html',1,'']]], + ['matrix_20multiplication_30',['Matrix multiplication',['https://docs.opencv.org/4.2.0/d2/dab/group__core__hal__interface__matrix__multiplication.html',1,'']]], + ['matrix_20reductions_31',['Matrix Reductions',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html',1,'']]], + ['matrix_20typedefs_32',['Global matrix typedefs',['https://eigen.tuxfamily.org/dox/group__matrixtypedefs.html',1,'']]], + ['maximum_33',['Element-wise minimum or maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'']]], + ['members_34',['Structures Having Eigen Members',['https://eigen.tuxfamily.org/dox/group__TopicStructHavingEigenMembers.html',1,'']]], + ['members_35',['Adaptors for pointers to members',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01511.html',1,'']]], + ['memory_36',['Memory',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01480.html',1,'']]], + ['merge_37',['Channel merge',['https://docs.opencv.org/4.2.0/df/d2e/group__core__hal__interface__merge.html',1,'']]], + ['meta_20module_38',['Sparse meta-module',['https://eigen.tuxfamily.org/dox/group__Sparse__Module.html',1,'']]], + ['metadata_20descriptors_39',['G-API Metadata Descriptors',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html',1,'']]], + ['metaprogramming_40',['Metaprogramming',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01485.html',1,'']]], + ['method_41',['Fast Marching Method',['https://docs.opencv.org/4.2.0/db/d18/group__videostab__marching.html',1,'']]], + ['methods_42',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], + ['metissupport_20module_43',['MetisSupport module',['https://eigen.tuxfamily.org/dox/group__MetisSupport__Module.html',1,'']]], + ['minimum_20or_20maximum_44',['Element-wise minimum or maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'']]], + ['miscellaneous_20image_20transformations_45',['Miscellaneous Image Transformations',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html',1,'']]], + ['model_46',['Fisheye camera model',['https://docs.opencv.org/4.2.0/db/d58/group__calib3d__fisheye.html',1,'']]], + ['models_47',['Deformable Part-based Models',['https://docs.opencv.org/4.2.0/d9/d12/group__dpm.html',1,'']]], + ['models_20and_20derivated_20tools_48',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], + ['module_49',['module',['https://eigen.tuxfamily.org/dox/group__Cholesky__Module.html',1,'Cholesky module'],['https://eigen.tuxfamily.org/dox/group__CholmodSupport__Module.html',1,'CholmodSupport module'],['https://eigen.tuxfamily.org/dox/group__Core__Module.html',1,'Core module'],['https://docs.opencv.org/4.2.0/d6/d0f/group__dnn.html',1,'Deep Neural Network module'],['https://eigen.tuxfamily.org/dox/group__Eigenvalues__Module.html',1,'Eigenvalues module'],['https://eigen.tuxfamily.org/dox/group__Geometry__Module.html',1,'Geometry module'],['https://eigen.tuxfamily.org/dox/group__Householder__Module.html',1,'Householder module'],['https://eigen.tuxfamily.org/dox/group__IterativeLinearSolvers__Module.html',1,'IterativeLinearSolvers module'],['https://eigen.tuxfamily.org/dox/group__Jacobi__Module.html',1,'Jacobi module'],['https://eigen.tuxfamily.org/dox/group__KLUSupport__Module.html',1,'KLUSupport module'],['https://eigen.tuxfamily.org/dox/group__LU__Module.html',1,'LU module'],['https://eigen.tuxfamily.org/dox/group__MetisSupport__Module.html',1,'MetisSupport module'],['https://eigen.tuxfamily.org/dox/group__OrderingMethods__Module.html',1,'OrderingMethods module'],['https://eigen.tuxfamily.org/dox/group__PardisoSupport__Module.html',1,'PardisoSupport module'],['https://eigen.tuxfamily.org/dox/group__PaStiXSupport__Module.html',1,'PaStiXSupport module'],['https://eigen.tuxfamily.org/dox/group__QR__Module.html',1,'QR module'],['https://eigen.tuxfamily.org/dox/group__Sparse__Module.html',1,'Sparse meta-module'],['https://eigen.tuxfamily.org/dox/group__SparseCholesky__Module.html',1,'SparseCholesky module'],['https://eigen.tuxfamily.org/dox/group__SparseCore__Module.html',1,'SparseCore module'],['https://eigen.tuxfamily.org/dox/group__SparseLU__Module.html',1,'SparseLU module'],['https://eigen.tuxfamily.org/dox/group__SparseQR__Module.html',1,'SparseQR module'],['https://eigen.tuxfamily.org/dox/group__SPQRSupport__Module.html',1,'SuiteSparseQR module'],['https://eigen.tuxfamily.org/dox/group__SuperLUSupport__Module.html',1,'SuperLUSupport module'],['https://eigen.tuxfamily.org/dox/group__SVD__Module.html',1,'SVD module'],['https://eigen.tuxfamily.org/dox/group__UmfPackSupport__Module.html',1,'UmfPackSupport module']]], + ['module_20brings_20implementations_20of_20different_20image_20hashing_20algorithms_50',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], + ['modules_51',['Support modules',['https://eigen.tuxfamily.org/dox/group__Support__modules.html',1,'']]], + ['morphology_20on_20run_20length_20encoded_20image_52',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], + ['motion_53',['Structure From Motion',['https://docs.opencv.org/4.2.0/d8/d8c/group__sfm.html',1,'']]], + ['motion_20analysis_54',['Motion Analysis',['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html',1,'']]], + ['motion_20analysis_20and_20object_20tracking_55',['Motion Analysis and Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'']]], + ['motion_20estimation_56',['Global Motion Estimation',['https://docs.opencv.org/4.2.0/d4/d2c/group__videostab__motion.html',1,'']]], + ['multi_20dimensional_20spaces_57',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], + ['multiplication_58',['Matrix multiplication',['https://docs.opencv.org/4.2.0/d2/dab/group__core__hal__interface__matrix__multiplication.html',1,'']]], + ['multiply_59',['Element-wise multiply',['https://docs.opencv.org/4.2.0/de/db7/group__core__hal__interface__multiply.html',1,'']]], + ['multiview_20stereo_20matching_60',['Multiview Stereo Matching',['https://docs.opencv.org/4.2.0/d7/dd5/group__datasets__msm.html',1,'']]], + ['mutating_61',['Mutating',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01489.html',1,'Mutating'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01490.html',1,'Non-Mutating']]], + ['mutexes_62',['Mutexes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html',1,'']]] ]; diff --git a/search/groups_12.js b/search/groups_12.js index 36e5758e..10c59f23 100644 --- a/search/groups_12.js +++ b/search/groups_12.js @@ -5,13 +5,13 @@ var searchData= ['o_20api_20backends_20registry_2',['Query I/O API backends registry',['https://docs.opencv.org/4.2.0/de/db1/group__videoio__registry.html',1,'']]], ['o_20routines_3',['Hierarchical Data Format I/O routines',['https://docs.opencv.org/4.2.0/db/d77/group__hdf.html',1,'']]], ['object_20categorization_4',['Object Categorization',['https://docs.opencv.org/4.2.0/de/d24/group__features2d__category.html',1,'']]], - ['object_20detection_5',['object detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'DNN used for object detection'],['https://docs.opencv.org/4.2.0/d4/d54/group__xobjdetect.html',1,'Extended object detection']]], - ['object_20detection_6',['Object Detection',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d9/d3f/group__cudaobjdetect.html',1,'Object Detection']]], + ['object_20detection_5',['Object Detection',['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d9/d3f/group__cudaobjdetect.html',1,'Object Detection']]], + ['object_20detection_6',['object detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'DNN used for object detection'],['https://docs.opencv.org/4.2.0/d4/d54/group__xobjdetect.html',1,'Extended object detection']]], ['object_20recognition_7',['Object Recognition',['https://docs.opencv.org/4.2.0/dc/d24/group__datasets__or.html',1,'']]], ['object_20recognition_20and_20pose_20estimation_20api_8',['3D object recognition and pose estimation API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'']]], ['object_20tracking_9',['Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'Motion Analysis and Object Tracking'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html',1,'Object Tracking']]], - ['objects_10',['Fixed-size vectorizable Eigen objects',['https://eigen.tuxfamily.org/dox/group__TopicFixedSizeVectorizable.html',1,'']]], - ['objects_11',['Function Objects',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html',1,'']]], + ['objects_10',['Function Objects',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html',1,'']]], + ['objects_11',['Fixed-size vectorizable Eigen objects',['https://eigen.tuxfamily.org/dox/group__TopicFixedSizeVectorizable.html',1,'']]], ['objects_20by_20value_20to_20functions_12',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], ['of_20any_20type_13',['Type-safe container of any type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01522.html',1,'']]], ['of_20coefficient_20wise_20math_20functions_14',['Catalog of coefficient-wise math functions',['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'']]], @@ -24,34 +24,31 @@ var searchData= ['ogre_203d_20visualiser_21',['OGRE 3D Visualiser',['https://docs.opencv.org/4.2.0/d2/d17/group__ovis.html',1,'']]], ['on_20arrays_22',['Operations on arrays',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html',1,'']]], ['on_20fuzzy_20mathematics_23',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], - ['on_20matrices_24',['on Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'Arithm Operations on Matrices'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'Core Operations on Matrices']]], + ['on_20matrices_24',['on Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'Arithm Operations on Matrices'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'Core Operations on Matrices'],['https://docs.opencv.org/4.2.0/d5/d8e/group__cudaarithm.html',1,'Operations on Matrices']]], ['on_20matrices_25',['Graph API: Operations on matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'']]], - ['on_20matrices_26',['Operations on Matrices',['https://docs.opencv.org/4.2.0/d5/d8e/group__cudaarithm.html',1,'']]], - ['on_20run_20length_20encoded_20image_27',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], - ['on_20stack_20alignment_28',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], - ['on_20unaligned_20arrays_29',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], - ['one_20color_20space_20to_20another_30',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], - ['opencl_20cl_20va_20interoperability_31',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], - ['opencl_20support_32',['OpenCL support',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html',1,'']]], - ['opencv_33',['ColorMaps in OpenCV',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html',1,'']]], - ['opencv_20samples_34',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]], - ['opengl_20interoperability_35',['OpenGL interoperability',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html',1,'']]], - ['opengl_20support_36',['OpenGL support',['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html',1,'']]], - ['operations_37',['operations',['https://docs.opencv.org/4.2.0/d2/d18/group__core__hal__interface__logical.html',1,'Bitwise logical operations'],['https://eigen.tuxfamily.org/dox/group__TutorialBlockOperations.html',1,'Block operations'],['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'C structures and operations'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html',1,'Generalized Numeric operations'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html',1,'Graph API: Math operations'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html',1,'Graph API: Pixelwise operations']]], - ['operations_38',['Operations',['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html',1,'Per-element Operations'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html',1,'Set Operations']]], - ['operations_39',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], - ['operations_20and_20functions_40',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], - ['operations_20classes_41',['Boolean Operations Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01508.html',1,'']]], - ['operations_20on_20arrays_42',['Operations on arrays',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html',1,'']]], - ['operations_20on_20matrices_43',['Operations on Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'Arithm Operations on Matrices'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'Core Operations on Matrices']]], - ['operations_20on_20matrices_44',['Graph API: Operations on matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'']]], - ['operations_20on_20matrices_45',['Operations on Matrices',['https://docs.opencv.org/4.2.0/d5/d8e/group__cudaarithm.html',1,'']]], - ['optical_20flow_46',['Optical Flow',['https://docs.opencv.org/4.2.0/d7/d3f/group__cudaoptflow.html',1,'']]], - ['optical_20flow_20algorithms_47',['Optical Flow Algorithms',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html',1,'']]], - ['optimization_20algorithms_48',['Optimization Algorithms',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html',1,'']]], - ['optional_20values_49',['Optional values',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html',1,'']]], - ['or_20maximum_50',['Element-wise minimum or maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'']]], - ['orderingmethods_20module_51',['OrderingMethods module',['https://eigen.tuxfamily.org/dox/group__OrderingMethods__Module.html',1,'']]], - ['orders_52',['Storage orders',['https://eigen.tuxfamily.org/dox/group__TopicStorageOrders.html',1,'']]], - ['output_53',['Input/Output',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html',1,'']]] + ['on_20run_20length_20encoded_20image_26',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]], + ['on_20stack_20alignment_27',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], + ['on_20unaligned_20arrays_28',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], + ['one_20color_20space_20to_20another_29',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], + ['opencl_20cl_20va_20interoperability_30',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], + ['opencl_20support_31',['OpenCL support',['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html',1,'']]], + ['opencv_32',['ColorMaps in OpenCV',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html',1,'']]], + ['opencv_20samples_33',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]], + ['opengl_20interoperability_34',['OpenGL interoperability',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html',1,'']]], + ['opengl_20support_35',['OpenGL support',['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html',1,'']]], + ['operations_36',['Operations',['https://docs.opencv.org/4.2.0/d8/d34/group__cudaarithm__elem.html',1,'Per-element Operations'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01492.html',1,'Set Operations']]], + ['operations_37',['operations',['https://docs.opencv.org/4.2.0/d2/d18/group__core__hal__interface__logical.html',1,'Bitwise logical operations'],['https://eigen.tuxfamily.org/dox/group__TutorialBlockOperations.html',1,'Block operations'],['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'C structures and operations'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01515.html',1,'Generalized Numeric operations'],['https://docs.opencv.org/4.2.0/da/dd3/group__gapi__math.html',1,'Graph API: Math operations'],['https://docs.opencv.org/4.2.0/d1/db2/group__gapi__pixelwise.html',1,'Graph API: Pixelwise operations'],['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'The Array class and coefficient-wise operations']]], + ['operations_20and_20functions_38',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], + ['operations_20classes_39',['Boolean Operations Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01508.html',1,'']]], + ['operations_20on_20arrays_40',['Operations on arrays',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html',1,'']]], + ['operations_20on_20matrices_41',['Operations on Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'Arithm Operations on Matrices'],['https://docs.opencv.org/4.2.0/de/d09/group__cudaarithm__core.html',1,'Core Operations on Matrices'],['https://docs.opencv.org/4.2.0/d5/d8e/group__cudaarithm.html',1,'Operations on Matrices']]], + ['operations_20on_20matrices_42',['Graph API: Operations on matrices',['https://docs.opencv.org/4.2.0/d0/d86/group__gapi__matrixop.html',1,'']]], + ['optical_20flow_43',['Optical Flow',['https://docs.opencv.org/4.2.0/d7/d3f/group__cudaoptflow.html',1,'']]], + ['optical_20flow_20algorithms_44',['Optical Flow Algorithms',['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html',1,'']]], + ['optimization_20algorithms_45',['Optimization Algorithms',['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html',1,'']]], + ['optional_20values_46',['Optional values',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html',1,'']]], + ['or_20maximum_47',['Element-wise minimum or maximum',['https://docs.opencv.org/4.2.0/dc/d19/group__core__hal__interface__minmax.html',1,'']]], + ['orderingmethods_20module_48',['OrderingMethods module',['https://eigen.tuxfamily.org/dox/group__OrderingMethods__Module.html',1,'']]], + ['orders_49',['Storage orders',['https://eigen.tuxfamily.org/dox/group__TopicStorageOrders.html',1,'']]], + ['output_50',['Input/Output',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html',1,'']]] ]; diff --git a/search/groups_13.js b/search/groups_13.js index e2ff906f..5296ef91 100644 --- a/search/groups_13.js +++ b/search/groups_13.js @@ -32,14 +32,12 @@ var searchData= ['primitives_29',['Drawing primitives',['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html',1,'']]], ['private_20implementation_20helpers_30',['Private implementation helpers',['https://docs.opencv.org/4.2.0/dd/d96/group__core__hal__intrin__impl.html',1,'']]], ['problems_20and_20decompositions_31',['Dense linear problems and decompositions',['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'']]], - ['processing_32',['Color space processing',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html',1,'']]], - ['processing_33',['Extended Image Processing',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html',1,'']]], - ['processing_34',['Fuzzy image processing',['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html',1,'']]], - ['processing_35',['Processing',['https://docs.opencv.org/4.2.0/d7/dbd/group__imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html',1,'NPPST Image Processing'],['https://docs.opencv.org/4.2.0/de/d25/group__npps.html',1,'NPPST Signal Processing'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html',1,'RGB-Depth Processing']]], - ['processing_20algorithms_36',['Additional photo processing algorithms',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html',1,'']]], - ['processing_20based_20on_20fuzzy_20mathematics_37',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], - ['processing_20functionality_38',['G-API Image processing functionality',['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'']]], - ['programs_39',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], - ['projection_40',['Projection',['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html',1,'']]], - ['propagating_20wrapper_41',['Const-propagating wrapper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01526.html',1,'']]] + ['processing_32',['Processing',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html',1,'Extended Image Processing'],['https://docs.opencv.org/4.2.0/d7/dbd/group__imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html',1,'NPPST Image Processing'],['https://docs.opencv.org/4.2.0/de/d25/group__npps.html',1,'NPPST Signal Processing'],['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html',1,'RGB-Depth Processing']]], + ['processing_33',['processing',['https://docs.opencv.org/4.2.0/db/d8c/group__cudaimgproc__color.html',1,'Color space processing'],['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html',1,'Fuzzy image processing']]], + ['processing_20algorithms_34',['Additional photo processing algorithms',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html',1,'']]], + ['processing_20based_20on_20fuzzy_20mathematics_35',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], + ['processing_20functionality_36',['G-API Image processing functionality',['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'']]], + ['programs_37',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], + ['projection_38',['Projection',['https://docs.opencv.org/4.2.0/d0/daf/group__projection.html',1,'']]], + ['propagating_20wrapper_39',['Const-propagating wrapper',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01526.html',1,'']]] ]; diff --git a/search/groups_15.js b/search/groups_15.js index 703280f7..21f238fd 100644 --- a/search/groups_15.js +++ b/search/groups_15.js @@ -10,25 +10,24 @@ var searchData= ['reciprocial_7',['Element-wise reciprocial',['https://docs.opencv.org/4.2.0/d4/de4/group__core__hal__interface__reciprocial.html',1,'']]], ['recognition_8',['Recognition',['https://docs.opencv.org/4.2.0/d4/d8b/group__datasets__ar.html',1,'Action Recognition'],['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html',1,'Face Recognition'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html',1,'Gesture Recognition'],['https://docs.opencv.org/4.2.0/dc/d24/group__datasets__or.html',1,'Object Recognition'],['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'Scene Text Detection and Recognition'],['https://docs.opencv.org/4.2.0/d8/df2/group__text__recognize.html',1,'Scene Text Recognition'],['https://docs.opencv.org/4.2.0/db/d7b/group__datasets__tr.html',1,'Text Recognition']]], ['recognition_20and_20pose_20estimation_20api_9',['3D object recognition and pose estimation API',['https://docs.opencv.org/4.2.0/d9/d02/group__cnn__3dobj.html',1,'']]], - ['reconstruction_10',['Camera Calibration and 3D Reconstruction',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html',1,'']]], + ['reconstruction_10',['Reconstruction',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html',1,'Camera Calibration and 3D Reconstruction'],['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html',1,'Reconstruction']]], ['reconstruction_11',['Custom Calibration Pattern for 3D reconstruction',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html',1,'']]], - ['reconstruction_12',['Reconstruction',['https://docs.opencv.org/4.2.0/da/db5/group__reconstruction.html',1,'']]], - ['reductions_13',['Matrix Reductions',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html',1,'']]], - ['reductions_20visitors_20and_20broadcasting_14',['Reductions, visitors and broadcasting',['https://eigen.tuxfamily.org/dox/group__TutorialReductionsVisitorsBroadcasting.html',1,'']]], - ['reference_15',['Reference',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__Reference.html',1,'Reference'],['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__Reference.html',1,'Reference'],['https://eigen.tuxfamily.org/dox/group__Sparse__Reference.html',1,'Reference'],['https://eigen.tuxfamily.org/dox/group__Geometry__Reference.html',1,'Reference']]], - ['reference_20guide_16',['Quick reference guide',['https://eigen.tuxfamily.org/dox/group__QuickRefPage.html',1,'']]], - ['reference_20guide_20for_20sparse_20matrices_17',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], - ['registration_18',['Registration',['https://docs.opencv.org/4.2.0/dc/def/group__datasets__ir.html',1,'Image Registration'],['https://docs.opencv.org/4.2.0/db/d61/group__reg.html',1,'Image Registration'],['https://docs.opencv.org/4.2.0/df/dc1/group__dnnLayerFactory.html',1,'Utilities for New Layers Registration']]], - ['registry_19',['Query I/O API backends registry',['https://docs.opencv.org/4.2.0/de/db1/group__videoio__registry.html',1,'']]], - ['regular_20expressions_20',['Regular Expressions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html',1,'']]], - ['rendering_21',['Non-Photorealistic Rendering',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html',1,'']]], - ['reshape_22',['Reshape',['https://eigen.tuxfamily.org/dox/group__TutorialReshape.html',1,'']]], + ['reductions_12',['Matrix Reductions',['https://docs.opencv.org/4.2.0/d5/de6/group__cudaarithm__reduce.html',1,'']]], + ['reductions_20visitors_20and_20broadcasting_13',['Reductions, visitors and broadcasting',['https://eigen.tuxfamily.org/dox/group__TutorialReductionsVisitorsBroadcasting.html',1,'']]], + ['reference_14',['Reference',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__Reference.html',1,'Reference'],['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__Reference.html',1,'Reference'],['https://eigen.tuxfamily.org/dox/group__Sparse__Reference.html',1,'Reference'],['https://eigen.tuxfamily.org/dox/group__Geometry__Reference.html',1,'Reference']]], + ['reference_20guide_15',['Quick reference guide',['https://eigen.tuxfamily.org/dox/group__QuickRefPage.html',1,'']]], + ['reference_20guide_20for_20sparse_20matrices_16',['Quick reference guide for sparse matrices',['https://eigen.tuxfamily.org/dox/group__SparseQuickRefPage.html',1,'']]], + ['registration_17',['Registration',['https://docs.opencv.org/4.2.0/dc/def/group__datasets__ir.html',1,'Image Registration'],['https://docs.opencv.org/4.2.0/db/d61/group__reg.html',1,'Image Registration'],['https://docs.opencv.org/4.2.0/df/dc1/group__dnnLayerFactory.html',1,'Utilities for New Layers Registration']]], + ['registry_18',['Query I/O API backends registry',['https://docs.opencv.org/4.2.0/de/db1/group__videoio__registry.html',1,'']]], + ['regular_20expressions_19',['Regular Expressions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01502.html',1,'']]], + ['rendering_20',['Non-Photorealistic Rendering',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html',1,'']]], + ['reshape_21',['Reshape',['https://eigen.tuxfamily.org/dox/group__TutorialReshape.html',1,'']]], + ['resolution_22',['Resolution',['https://docs.opencv.org/4.2.0/d1/d5b/group__datasets__sr.html',1,'Super Resolution'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html',1,'Super Resolution']]], ['resolution_23',['DNN used for super resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'']]], - ['resolution_24',['Resolution',['https://docs.opencv.org/4.2.0/d1/d5b/group__datasets__sr.html',1,'Super Resolution'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html',1,'Super Resolution']]], - ['rgb_20depth_20processing_25',['RGB-Depth Processing',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html',1,'']]], - ['robust_20estimation_26',['Robust Estimation',['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html',1,'']]], - ['root_20calculation_27',['root calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'Inverse square root calculation'],['https://docs.opencv.org/4.2.0/d5/dc3/group__core__hal__interface__sqrt.html',1,'Square root calculation']]], - ['rotation_20estimation_28',['Rotation Estimation',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html',1,'']]], - ['routines_29',['Hierarchical Data Format I/O routines',['https://docs.opencv.org/4.2.0/db/d77/group__hdf.html',1,'']]], - ['run_20length_20encoded_20image_30',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]] + ['rgb_20depth_20processing_24',['RGB-Depth Processing',['https://docs.opencv.org/4.2.0/d2/d3a/group__rgbd.html',1,'']]], + ['robust_20estimation_25',['Robust Estimation',['https://docs.opencv.org/4.2.0/db/d3a/group__robust.html',1,'']]], + ['root_20calculation_26',['root calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'Inverse square root calculation'],['https://docs.opencv.org/4.2.0/d5/dc3/group__core__hal__interface__sqrt.html',1,'Square root calculation']]], + ['rotation_20estimation_27',['Rotation Estimation',['https://docs.opencv.org/4.2.0/d7/d74/group__stitching__rotation.html',1,'']]], + ['routines_28',['Hierarchical Data Format I/O routines',['https://docs.opencv.org/4.2.0/db/d77/group__hdf.html',1,'']]], + ['run_20length_20encoded_20image_29',['Binary morphology on run-length encoded image',['https://docs.opencv.org/4.2.0/df/def/group__ximgproc__run__length__morphology.html',1,'']]] ]; diff --git a/search/groups_16.js b/search/groups_16.js index 9144d85d..3e9cf8d5 100644 --- a/search/groups_16.js +++ b/search/groups_16.js @@ -47,8 +47,8 @@ var searchData= ['special_20functions_44',['Special Functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html',1,'Mathematical Special Functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html',1,'Mathematical Special Functions']]], ['splines_5fmodule_45',['Splines_Module',['https://eigen.tuxfamily.org/dox/group__Splines__Module.html',1,'']]], ['split_46',['Channel split',['https://docs.opencv.org/4.2.0/df/df2/group__core__hal__interface__split.html',1,'']]], - ['square_20root_20calculation_47',['Inverse square root calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'']]], - ['square_20root_20calculation_48',['Square root calculation',['https://docs.opencv.org/4.2.0/d5/dc3/group__core__hal__interface__sqrt.html',1,'']]], + ['square_20root_20calculation_47',['Square root calculation',['https://docs.opencv.org/4.2.0/d5/dc3/group__core__hal__interface__sqrt.html',1,'']]], + ['square_20root_20calculation_48',['Inverse square root calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'']]], ['squares_20systems_49',['Solving linear least squares systems',['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'']]], ['sse_20utilities_50',['SSE utilities',['https://docs.opencv.org/4.2.0/d6/d06/group__core__utils__sse.html',1,'']]], ['stabilization_51',['Video Stabilization',['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html',1,'']]], @@ -68,16 +68,16 @@ var searchData= ['structure_20type_65',['Data Structure Type',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01539.html',1,'']]], ['structured_20forests_20for_20fast_20edge_20detection_66',['Structured forests for fast edge detection',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html',1,'']]], ['structured_20light_20api_67',['Structured Light API',['https://docs.opencv.org/4.2.0/d1/d90/group__structured__light.html',1,'']]], - ['structures_68',['Basic structures',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html',1,'']]], - ['structures_69',['Structures',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html',1,'Data Structures'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01536.html',1,'Policy-Based Data Structures']]], + ['structures_68',['Structures',['https://docs.opencv.org/4.2.0/d9/d41/group__cudacore__struct.html',1,'Data Structures'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01536.html',1,'Policy-Based Data Structures']]], + ['structures_69',['Basic structures',['https://docs.opencv.org/4.2.0/dc/d84/group__core__basic.html',1,'']]], ['structures_20and_20operations_70',['C structures and operations',['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'']]], ['structures_20having_20eigen_20members_71',['Structures Having Eigen Members',['https://eigen.tuxfamily.org/dox/group__TopicStructHavingEigenMembers.html',1,'']]], ['subdivision_72',['Planar Subdivision',['https://docs.opencv.org/4.2.0/df/d5b/group__imgproc__subdiv2d.html',1,'']]], ['subtract_73',['Element-wise add and subtract',['https://docs.opencv.org/4.2.0/d8/d6f/group__core__hal__interface__addsub.html',1,'']]], ['suitesparseqr_20module_74',['SuiteSparseQR module',['https://eigen.tuxfamily.org/dox/group__SPQRSupport__Module.html',1,'']]], ['sum_75',['Element-wise weighted sum',['https://docs.opencv.org/4.2.0/da/d9b/group__core__hal__interface__addWeighted.html',1,'']]], - ['super_20resolution_76',['DNN used for super resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'']]], - ['super_20resolution_77',['Super Resolution',['https://docs.opencv.org/4.2.0/d1/d5b/group__datasets__sr.html',1,'Super Resolution'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html',1,'Super Resolution']]], + ['super_20resolution_76',['Super Resolution',['https://docs.opencv.org/4.2.0/d1/d5b/group__datasets__sr.html',1,'Super Resolution'],['https://docs.opencv.org/4.2.0/d7/d0a/group__superres.html',1,'Super Resolution']]], + ['super_20resolution_77',['DNN used for super resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'']]], ['superlusupport_20module_78',['SuperLUSupport module',['https://eigen.tuxfamily.org/dox/group__SuperLUSupport__Module.html',1,'']]], ['superpixels_79',['Superpixels',['https://docs.opencv.org/4.2.0/df/d6c/group__ximgproc__superpixel.html',1,'']]], ['support_80',['support',['https://docs.opencv.org/4.2.0/d0/daf/group__core__eigen.html',1,'Eigen support'],['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html',1,'Legacy support'],['https://docs.opencv.org/4.2.0/d5/d8e/group__f0__math.html',1,'Math with F0-transform support'],['https://docs.opencv.org/4.2.0/d6/df0/group__f1__math.html',1,'Math with F1-transform support'],['https://docs.opencv.org/4.2.0/dc/d83/group__core__opencl.html',1,'OpenCL support'],['https://docs.opencv.org/4.2.0/df/d24/group__highgui__opengl.html',1,'OpenGL support'],['https://docs.opencv.org/4.2.0/d7/dcc/group__core__utils__softfloat.html',1,'Softfloat support'],['https://docs.opencv.org/4.2.0/d6/d2f/group__highgui__winrt.html',1,'WinRT support']]], @@ -85,6 +85,6 @@ var searchData= ['surface_20matching_82',['Surface Matching',['https://docs.opencv.org/4.2.0/d9/d25/group__surface__matching.html',1,'']]], ['svd_20module_83',['SVD module',['https://eigen.tuxfamily.org/dox/group__SVD__Module.html',1,'']]], ['system_20functions_20and_20macros_84',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], - ['systems_85',['Solving linear least squares systems',['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'']]], - ['systems_86',['Solving Sparse Linear Systems',['https://eigen.tuxfamily.org/dox/group__TopicSparseSystems.html',1,'']]] + ['systems_85',['Solving Sparse Linear Systems',['https://eigen.tuxfamily.org/dox/group__TopicSparseSystems.html',1,'']]], + ['systems_86',['Solving linear least squares systems',['https://eigen.tuxfamily.org/dox/group__LeastSquares.html',1,'']]] ]; diff --git a/search/groups_18.js b/search/groups_18.js index 113cd3db..d36c29ec 100644 --- a/search/groups_18.js +++ b/search/groups_18.js @@ -10,12 +10,9 @@ var searchData= ['used_20for_20super_20resolution_7',['DNN used for super resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'']]], ['using_20stl_20containers_20with_20eigen_8',['Using STL Containers with Eigen',['https://eigen.tuxfamily.org/dox/group__TopicStlContainers.html',1,'']]], ['utf_208_20strings_20with_20freetype_20harfbuzz_9',['Drawing UTF-8 strings with freetype/harfbuzz',['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html',1,'']]], - ['utilities_10',['NEON utilities',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html',1,'']]], - ['utilities_11',['Random Number Utilities',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01547.html',1,'']]], - ['utilities_12',['SSE utilities',['https://docs.opencv.org/4.2.0/d6/d06/group__core__utils__sse.html',1,'']]], - ['utilities_13',['Utilities',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html',1,'']]], - ['utilities_14',['VSX utilities',['https://docs.opencv.org/4.2.0/d3/d50/group__core__utils__vsx.html',1,'']]], - ['utilities_20for_20new_20layers_20registration_15',['Utilities for New Layers Registration',['https://docs.opencv.org/4.2.0/df/dc1/group__dnnLayerFactory.html',1,'']]], - ['utility_20and_20system_20functions_20and_20macros_16',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], - ['utility_20functions_20for_20opencv_20samples_17',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]] + ['utilities_10',['Utilities',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01547.html',1,'Random Number Utilities'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01486.html',1,'Utilities']]], + ['utilities_11',['utilities',['https://docs.opencv.org/4.2.0/d8/d45/group__core__utils__neon.html',1,'NEON utilities'],['https://docs.opencv.org/4.2.0/d6/d06/group__core__utils__sse.html',1,'SSE utilities'],['https://docs.opencv.org/4.2.0/d3/d50/group__core__utils__vsx.html',1,'VSX utilities']]], + ['utilities_20for_20new_20layers_20registration_12',['Utilities for New Layers Registration',['https://docs.opencv.org/4.2.0/df/dc1/group__dnnLayerFactory.html',1,'']]], + ['utility_20and_20system_20functions_20and_20macros_13',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], + ['utility_20functions_20for_20opencv_20samples_14',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]] ]; diff --git a/search/groups_19.js b/search/groups_19.js index 44b4f500..dd24bba0 100644 --- a/search/groups_19.js +++ b/search/groups_19.js @@ -1,18 +1,18 @@ var searchData= [ ['va_20api_20opencl_20cl_20va_20interoperability_0',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], - ['value_20matrix_20decomposition_1',['Singular value matrix decomposition',['https://docs.opencv.org/4.2.0/dd/d2a/group__core__hal__interface__decomp__svd.html',1,'']]], - ['value_20to_20functions_2',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], - ['values_3',['Optional values',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html',1,'']]], - ['variables_4',['Condition Variables',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html',1,'']]], - ['vector_20arithmetic_5',['Matrix and vector arithmetic',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixArithmetic.html',1,'']]], - ['vectorizable_20eigen_20objects_6',['Fixed-size vectorizable Eigen objects',['https://eigen.tuxfamily.org/dox/group__TopicFixedSizeVectorizable.html',1,'']]], - ['version_205_7',['Hierarchical Data Format version 5',['https://docs.opencv.org/4.2.0/d6/dee/group__hdf5.html',1,'']]], - ['video_20analysis_8',['Video Analysis',['https://docs.opencv.org/4.2.0/d7/de9/group__video.html',1,'']]], - ['video_20encoding_20decoding_9',['Video Encoding/Decoding',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html',1,'']]], - ['video_20i_20o_10',['video I O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__c.html',1,'C API for video I/O'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html',1,'Flags for video I/O'],['https://docs.opencv.org/4.2.0/d5/d26/group__videoio__ios.html',1,'iOS glue for video I/O']]], + ['va_20interoperability_1',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], + ['value_20matrix_20decomposition_2',['Singular value matrix decomposition',['https://docs.opencv.org/4.2.0/dd/d2a/group__core__hal__interface__decomp__svd.html',1,'']]], + ['value_20to_20functions_3',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], + ['values_4',['Optional values',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html',1,'']]], + ['variables_5',['Condition Variables',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01477.html',1,'']]], + ['vector_20arithmetic_6',['Matrix and vector arithmetic',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixArithmetic.html',1,'']]], + ['vectorizable_20eigen_20objects_7',['Fixed-size vectorizable Eigen objects',['https://eigen.tuxfamily.org/dox/group__TopicFixedSizeVectorizable.html',1,'']]], + ['version_205_8',['Hierarchical Data Format version 5',['https://docs.opencv.org/4.2.0/d6/dee/group__hdf5.html',1,'']]], + ['video_20analysis_9',['Video Analysis',['https://docs.opencv.org/4.2.0/d7/de9/group__video.html',1,'']]], + ['video_20encoding_20decoding_10',['Video Encoding/Decoding',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html',1,'']]], ['video_20i_20o_11',['Video I/O',['https://docs.opencv.org/4.2.0/dd/de7/group__videoio.html',1,'']]], - ['video_20i_20o_12',['WinRT glue for video I/O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html',1,'']]], + ['video_20i_20o_12',['video I O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__c.html',1,'C API for video I/O'],['https://docs.opencv.org/4.2.0/d4/d15/group__videoio__flags__base.html',1,'Flags for video I/O'],['https://docs.opencv.org/4.2.0/d5/d26/group__videoio__ios.html',1,'iOS glue for video I/O'],['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__winrt.html',1,'WinRT glue for video I/O']]], ['video_20i_20o_20api_20backends_13',['Additional flags for video I/O API backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'']]], ['video_20stabilization_14',['Video Stabilization',['https://docs.opencv.org/4.2.0/d5/d50/group__videostab.html',1,'']]], ['vision_15',['CUDA-accelerated Computer Vision',['https://docs.opencv.org/4.2.0/d1/d1e/group__cuda.html',1,'']]], diff --git a/search/groups_4.js b/search/groups_4.js index a856e73e..a34b3e69 100644 --- a/search/groups_4.js +++ b/search/groups_4.js @@ -16,34 +16,34 @@ var searchData= ['algebra_13',['Sparse linear algebra',['https://eigen.tuxfamily.org/dox/group__Sparse__chapter.html',1,'']]], ['algebra_20and_20decompositions_14',['Linear algebra and decompositions',['https://eigen.tuxfamily.org/dox/group__TutorialLinearAlgebra.html',1,'']]], ['algorithm_15',['Experimental 2D Features Matching Algorithm',['https://docs.opencv.org/4.2.0/db/dd9/group__xfeatures2d__match.html',1,'']]], - ['algorithms_16',['Additional photo processing algorithms',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html',1,'']]], - ['algorithms_17',['Algorithms',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01488.html',1,'Algorithms'],['https://docs.opencv.org/4.2.0/d7/d7a/group__xfeatures2d__experiment.html',1,'Experimental 2D Features Algorithms'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html',1,'Non-free 2D Features Algorithms'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html',1,'Optical Flow Algorithms'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html',1,'Optimization Algorithms'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html',1,'Stereo Correspondance Algorithms']]], - ['algorithms_18',['algorithms',['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'STL iterators and algorithms'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'The module brings implementations of different image hashing algorithms.']]], - ['aliasing_19',['Aliasing',['https://eigen.tuxfamily.org/dox/group__TopicAliasing.html',1,'']]], - ['aligned_20box_20typedefs_20',['Global aligned box typedefs',['https://eigen.tuxfamily.org/dox/group__alignedboxtypedefs.html',1,'']]], - ['alignment_21',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], - ['alignment_20issues_22',['Alignment issues',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__Alignement.html',1,'']]], - ['allocators_23',['Allocators',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01499.html',1,'']]], - ['an_20image_24',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], - ['analysis_25',['Analysis',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html',1,'Face Analysis'],['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html',1,'Motion Analysis'],['https://docs.opencv.org/4.2.0/d7/de9/group__video.html',1,'Video Analysis']]], - ['analysis_20and_20object_20tracking_26',['Motion Analysis and Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'']]], - ['analysis_20and_20shape_20descriptors_27',['Structural Analysis and Shape Descriptors',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'']]], - ['analysis_20iqa_20api_28',['Image Quality Analysis (IQA) API',['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'']]], - ['and_203d_20reconstruction_29',['Camera Calibration and 3D Reconstruction',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html',1,'']]], - ['and_20algorithms_30',['STL iterators and algorithms',['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'']]], - ['and_20array_20manipulation_31',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], - ['and_20broadcasting_32',['Reductions, visitors and broadcasting',['https://eigen.tuxfamily.org/dox/group__TutorialReductionsVisitorsBroadcasting.html',1,'']]], - ['and_20channel_20composition_20functions_33',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], - ['and_20coefficient_20wise_20operations_34',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], - ['and_20composition_20functionality_35',['G-API Drawing and composition functionality',['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'']]], - ['and_20decompositions_36',['and decompositions',['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'Dense linear problems and decompositions'],['https://eigen.tuxfamily.org/dox/group__TutorialLinearAlgebra.html',1,'Linear algebra and decompositions']]], - ['and_20derivated_20tools_37',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], - ['and_20description_38',['and Description',['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description']]], - ['and_20functions_39',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], - ['and_20images_20matching_40',['Features Finding and Images Matching',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'']]], - ['and_20implementation_20classes_41',['and Implementation Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01501.html',1,'Base and Implementation Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01497.html',1,'Base and Implementation Classes']]], - ['and_20indexing_42',['Slicing and Indexing',['https://eigen.tuxfamily.org/dox/group__TutorialSlicingIndexing.html',1,'']]], - ['and_20information_43',['Initialization and Information',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html',1,'']]], + ['algorithms_16',['Algorithms',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01488.html',1,'Algorithms'],['https://docs.opencv.org/4.2.0/d7/d7a/group__xfeatures2d__experiment.html',1,'Experimental 2D Features Algorithms'],['https://docs.opencv.org/4.2.0/d2/dca/group__xfeatures2d__nonfree.html',1,'Non-free 2D Features Algorithms'],['https://docs.opencv.org/4.2.0/d2/d84/group__optflow.html',1,'Optical Flow Algorithms'],['https://docs.opencv.org/4.2.0/da/d01/group__core__optim.html',1,'Optimization Algorithms'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html',1,'Stereo Correspondance Algorithms']]], + ['algorithms_17',['algorithms',['https://docs.opencv.org/4.2.0/de/daa/group__xphoto.html',1,'Additional photo processing algorithms'],['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'STL iterators and algorithms'],['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'The module brings implementations of different image hashing algorithms.']]], + ['aliasing_18',['Aliasing',['https://eigen.tuxfamily.org/dox/group__TopicAliasing.html',1,'']]], + ['aligned_20box_20typedefs_19',['Global aligned box typedefs',['https://eigen.tuxfamily.org/dox/group__alignedboxtypedefs.html',1,'']]], + ['alignment_20',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], + ['alignment_20issues_21',['Alignment issues',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__Alignement.html',1,'']]], + ['allocators_22',['Allocators',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01499.html',1,'']]], + ['an_20image_23',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], + ['analysis_24',['Analysis',['https://docs.opencv.org/4.2.0/db/d7c/group__face.html',1,'Face Analysis'],['https://docs.opencv.org/4.2.0/de/de1/group__video__motion.html',1,'Motion Analysis'],['https://docs.opencv.org/4.2.0/d7/de9/group__video.html',1,'Video Analysis']]], + ['analysis_20and_20object_20tracking_25',['Motion Analysis and Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'']]], + ['analysis_20and_20shape_20descriptors_26',['Structural Analysis and Shape Descriptors',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'']]], + ['analysis_20iqa_20api_27',['Image Quality Analysis (IQA) API',['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'']]], + ['and_203d_20reconstruction_28',['Camera Calibration and 3D Reconstruction',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html',1,'']]], + ['and_20algorithms_29',['STL iterators and algorithms',['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'']]], + ['and_20array_20manipulation_30',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], + ['and_20broadcasting_31',['Reductions, visitors and broadcasting',['https://eigen.tuxfamily.org/dox/group__TutorialReductionsVisitorsBroadcasting.html',1,'']]], + ['and_20channel_20composition_20functions_32',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], + ['and_20coefficient_20wise_20operations_33',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], + ['and_20composition_20functionality_34',['G-API Drawing and composition functionality',['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'']]], + ['and_20decompositions_35',['and decompositions',['https://eigen.tuxfamily.org/dox/group__DenseLinearSolvers__chapter.html',1,'Dense linear problems and decompositions'],['https://eigen.tuxfamily.org/dox/group__TutorialLinearAlgebra.html',1,'Linear algebra and decompositions']]], + ['and_20derivated_20tools_36',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], + ['and_20description_37',['and Description',['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description']]], + ['and_20functions_38',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], + ['and_20images_20matching_39',['Features Finding and Images Matching',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'']]], + ['and_20implementation_20classes_40',['and Implementation Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01501.html',1,'Base and Implementation Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01497.html',1,'Base and Implementation Classes']]], + ['and_20indexing_41',['Slicing and Indexing',['https://eigen.tuxfamily.org/dox/group__TutorialSlicingIndexing.html',1,'']]], + ['and_20information_42',['Initialization and Information',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html',1,'']]], + ['and_20macros_43',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], ['and_20matches_44',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], ['and_20matching_45',['Shape Distance and Matching',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html',1,'']]], ['and_20object_20tracking_46',['Motion Analysis and Object Tracking',['https://docs.opencv.org/4.2.0/d7/df3/group__imgproc__motion.html',1,'']]], @@ -83,24 +83,22 @@ var searchData= ['ar_80',['Ar',['../group__ar.html',1,'']]], ['arguments_81',['G-API Graph Compilation Arguments',['https://docs.opencv.org/4.2.0/d9/d29/group__gapi__compile__args.html',1,'']]], ['arithm_20operations_20on_20matrices_82',['Arithm Operations on Matrices',['https://docs.opencv.org/4.2.0/d9/d88/group__cudaarithm__arithm.html',1,'']]], - ['arithmetic_83',['Decimal Floating-Point Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01520.html',1,'']]], + ['arithmetic_83',['Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01520.html',1,'Decimal Floating-Point Arithmetic'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html',1,'Rational Arithmetic']]], ['arithmetic_84',['Matrix and vector arithmetic',['https://eigen.tuxfamily.org/dox/group__TutorialMatrixArithmetic.html',1,'']]], - ['arithmetic_85',['Rational Arithmetic',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01483.html',1,'']]], - ['arithmetic_20classes_86',['Arithmetic Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01506.html',1,'']]], - ['array_20class_20and_20coefficient_20wise_20operations_87',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], - ['array_20creation_20functions_88',['Array creation functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01523.html',1,'']]], - ['array_20manipulation_89',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], - ['array_20typedefs_90',['Global array typedefs',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html',1,'']]], - ['arrays_91',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], - ['arrays_92',['Numeric Arrays',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html',1,'']]], - ['arrays_93',['Operations on arrays',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html',1,'']]], - ['aruco_20marker_20detection_94',['ArUco Marker Detection',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html',1,'']]], - ['assertion_20on_20unaligned_20arrays_95',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], - ['associative_96',['Associative',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01471.html',1,'Associative'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01472.html',1,'Unordered Associative']]], - ['assumption_20on_20stack_20alignment_97',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], - ['asynchronous_20api_98',['Asynchronous API',['https://docs.opencv.org/4.2.0/da/d57/group__core__async.html',1,'']]], - ['asynchronous_20c_20c_20converters_99',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], - ['atan_20calculation_100',['Atan calculation',['https://docs.opencv.org/4.2.0/d5/df4/group__core__hal__interface__fastAtan.html',1,'']]], - ['atomics_101',['Atomics',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html',1,'']]], - ['autocalibration_102',['Autocalibration',['https://docs.opencv.org/4.2.0/d4/dbc/group__stitching__autocalib.html',1,'']]] + ['arithmetic_20classes_85',['Arithmetic Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01506.html',1,'']]], + ['array_20class_20and_20coefficient_20wise_20operations_86',['The Array class and coefficient-wise operations',['https://eigen.tuxfamily.org/dox/group__TutorialArrayClass.html',1,'']]], + ['array_20creation_20functions_87',['Array creation functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01523.html',1,'']]], + ['array_20manipulation_88',['Dense matrix and array manipulation',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__chapter.html',1,'']]], + ['array_20typedefs_89',['Global array typedefs',['https://eigen.tuxfamily.org/dox/group__arraytypedefs.html',1,'']]], + ['arrays_90',['Numeric Arrays',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01487.html',1,'']]], + ['arrays_91',['arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'Explanation of the assertion on unaligned arrays'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html',1,'Operations on arrays']]], + ['aruco_20marker_20detection_92',['ArUco Marker Detection',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html',1,'']]], + ['assertion_20on_20unaligned_20arrays_93',['Explanation of the assertion on unaligned arrays',['https://eigen.tuxfamily.org/dox/group__TopicUnalignedArrayAssert.html',1,'']]], + ['associative_94',['Associative',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01471.html',1,'Associative'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01472.html',1,'Unordered Associative']]], + ['assumption_20on_20stack_20alignment_95',['Compiler making a wrong assumption on stack alignment',['https://eigen.tuxfamily.org/dox/group__TopicWrongStackAlignment.html',1,'']]], + ['asynchronous_20api_96',['Asynchronous API',['https://docs.opencv.org/4.2.0/da/d57/group__core__async.html',1,'']]], + ['asynchronous_20c_20c_20converters_97',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], + ['atan_20calculation_98',['Atan calculation',['https://docs.opencv.org/4.2.0/d5/df4/group__core__hal__interface__fastAtan.html',1,'']]], + ['atomics_99',['Atomics',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01494.html',1,'']]], + ['autocalibration_100',['Autocalibration',['https://docs.opencv.org/4.2.0/d4/dbc/group__stitching__autocalib.html',1,'']]] ]; diff --git a/search/groups_5.js b/search/groups_5.js index 883a3023..0d85644f 100644 --- a/search/groups_5.js +++ b/search/groups_5.js @@ -1,7 +1,7 @@ var searchData= [ - ['backends_0',['Additional flags for video I/O API backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'']]], - ['backends_1',['G-API Standard Backends',['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html',1,'']]], + ['backends_0',['G-API Standard Backends',['https://docs.opencv.org/4.2.0/dc/d1c/group__gapi__std__backends.html',1,'']]], + ['backends_1',['Additional flags for video I/O API backends',['https://docs.opencv.org/4.2.0/dc/dfc/group__videoio__flags__others.html',1,'']]], ['backends_20registry_2',['Query I/O API backends registry',['https://docs.opencv.org/4.2.0/de/db1/group__videoio__registry.html',1,'']]], ['background_20foreground_20segmentation_20methods_3',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], ['background_20segmentation_4',['Background Segmentation',['https://docs.opencv.org/4.2.0/d6/d17/group__cudabgsegm.html',1,'']]], diff --git a/search/groups_6.js b/search/groups_6.js index 6dbe9775..29443ed2 100644 --- a/search/groups_6.js +++ b/search/groups_6.js @@ -4,10 +4,10 @@ var searchData= ['c_20api_1',['C API',['https://docs.opencv.org/4.2.0/df/d4e/group__imgproc__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/da/d0a/group__imgcodecs__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d0/d28/group__highgui__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d3/d12/group__video__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d5/db8/group__calib3d__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d9/d31/group__objdetect__c.html',1,'C API'],['https://docs.opencv.org/4.2.0/d3/d40/group__photo__c.html',1,'C API']]], ['c_20api_20for_20video_20i_20o_2',['C API for video I/O',['https://docs.opencv.org/4.2.0/dd/d01/group__videoio__c.html',1,'']]], ['c_20c_20converters_3',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], - ['c_20structures_20and_20operations_4',['C structures and operations',['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'']]], - ['calculation_5',['calculation',['https://docs.opencv.org/4.2.0/d5/df4/group__core__hal__interface__fastAtan.html',1,'Atan calculation'],['https://docs.opencv.org/4.2.0/d4/d8a/group__core__hal__interface__exp.html',1,'Exponent calculation']]], + ['c_20converters_4',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], + ['c_20structures_20and_20operations_5',['C structures and operations',['https://docs.opencv.org/4.2.0/d2/df8/group__core__c.html',1,'']]], ['calculation_6',['Histogram Calculation',['https://docs.opencv.org/4.2.0/d8/d0e/group__cudaimgproc__hist.html',1,'']]], - ['calculation_7',['calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'Inverse square root calculation'],['https://docs.opencv.org/4.2.0/d7/d99/group__core__hal__interface__magnitude.html',1,'Magnitude calculation'],['https://docs.opencv.org/4.2.0/d2/de4/group__core__hal__interface__log.html',1,'Natural logarithm calculation'],['https://docs.opencv.org/4.2.0/d5/dc3/group__core__hal__interface__sqrt.html',1,'Square root calculation']]], + ['calculation_7',['calculation',['https://docs.opencv.org/4.2.0/d5/df4/group__core__hal__interface__fastAtan.html',1,'Atan calculation'],['https://docs.opencv.org/4.2.0/d4/d8a/group__core__hal__interface__exp.html',1,'Exponent calculation'],['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'Inverse square root calculation'],['https://docs.opencv.org/4.2.0/d7/d99/group__core__hal__interface__magnitude.html',1,'Magnitude calculation'],['https://docs.opencv.org/4.2.0/d2/de4/group__core__hal__interface__log.html',1,'Natural logarithm calculation'],['https://docs.opencv.org/4.2.0/d5/dc3/group__core__hal__interface__sqrt.html',1,'Square root calculation']]], ['calibration_20and_203d_20reconstruction_8',['Camera Calibration and 3D Reconstruction',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html',1,'']]], ['calibration_20pattern_20for_203d_20reconstruction_9',['Custom Calibration Pattern for 3D reconstruction',['https://docs.opencv.org/4.2.0/d3/ddc/group__ccalib.html',1,'']]], ['camera_20access_10',['Camera Access',['../group__camera.html',1,'']]], diff --git a/search/groups_7.js b/search/groups_7.js index e865cf7d..2de449c5 100644 --- a/search/groups_7.js +++ b/search/groups_7.js @@ -23,33 +23,31 @@ var searchData= ['derivated_20tools_20',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], ['description_21',['Description',['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description']]], ['descriptor_20matchers_22',['Descriptor Matchers',['https://docs.opencv.org/4.2.0/d8/d9b/group__features2d__match.html',1,'']]], - ['descriptors_23',['Fourier descriptors',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html',1,'']]], - ['descriptors_24',['Descriptors',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html',1,'G-API Metadata Descriptors'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'Structural Analysis and Shape Descriptors']]], + ['descriptors_23',['Descriptors',['https://docs.opencv.org/4.2.0/d3/d0c/group__gapi__meta__args.html',1,'G-API Metadata Descriptors'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html',1,'Structural Analysis and Shape Descriptors']]], + ['descriptors_24',['Fourier descriptors',['https://docs.opencv.org/4.2.0/dd/ddc/group__ximgproc__fourier.html',1,'']]], ['descriptors_20for_20lines_20extracted_20from_20an_20image_25',['Binary descriptors for lines extracted from an image',['https://docs.opencv.org/4.2.0/dc/ddd/group__line__descriptor.html',1,'']]], - ['detection_26',['ArUco Marker Detection',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html',1,'']]], - ['detection_27',['detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'DNN used for object detection'],['https://docs.opencv.org/4.2.0/d4/d54/group__xobjdetect.html',1,'Extended object detection']]], - ['detection_28',['Detection',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d9/d3f/group__cudaobjdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html',1,'Pedestrian Detection'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html',1,'Scene Text Detection']]], - ['detection_29',['Structured forests for fast edge detection',['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html',1,'']]], - ['detection_20and_20description_30',['Detection and Description',['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description']]], - ['detection_20and_20recognition_31',['Scene Text Detection and Recognition',['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'']]], - ['detector_32',['Fast line detector',['https://docs.opencv.org/4.2.0/df/ded/group__ximgproc__fast__line__detector.html',1,'']]], - ['device_20layer_33',['Device layer',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html',1,'']]], - ['diagnostics_34',['Diagnostics',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01473.html',1,'']]], - ['difference_35',['Element-wise absolute difference',['https://docs.opencv.org/4.2.0/d5/dec/group__core__hal__interface__absdiff.html',1,'']]], - ['different_20datasets_36',['Framework for working with different datasets',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html',1,'']]], - ['different_20image_20hashing_20algorithms_37',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], - ['dimensional_20spaces_38',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], - ['directx_20interoperability_39',['DirectX interoperability',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html',1,'']]], - ['distance_20and_20matching_40',['Shape Distance and Matching',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html',1,'']]], - ['distributions_41',['Distributions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html',1,'Bernoulli Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html',1,'Normal Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html',1,'Poisson Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01542.html',1,'Random Number Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html',1,'Uniform Distributions']]], - ['divide_42',['Element-wise divide',['https://docs.opencv.org/4.2.0/dd/d2c/group__core__hal__interface__divide.html',1,'']]], - ['dnn_20used_20for_20object_20detection_43',['DNN used for object detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'']]], - ['dnn_20used_20for_20super_20resolution_44',['DNN used for super resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'']]], - ['drawing_20and_20composition_20functionality_45',['G-API Drawing and composition functionality',['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'']]], - ['drawing_20function_20of_20keypoints_20and_20matches_46',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], - ['drawing_20functions_47',['Drawing Functions',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html',1,'']]], - ['drawing_20operations_20and_20functions_48',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], - ['drawing_20primitives_49',['Drawing primitives',['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html',1,'']]], - ['drawing_20utf_208_20strings_20with_20freetype_20harfbuzz_50',['Drawing UTF-8 strings with freetype/harfbuzz',['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html',1,'']]], - ['dynamic_20bitset_51',['Dynamic Bitset.',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html',1,'']]] + ['detection_26',['Detection',['https://docs.opencv.org/4.2.0/d9/d6a/group__aruco.html',1,'ArUco Marker Detection'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/dc/d6d/group__cudaimgproc__feature.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/df/dfb/group__imgproc__object.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d5/d54/group__objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d9/d3f/group__cudaobjdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html',1,'Pedestrian Detection'],['https://docs.opencv.org/4.2.0/da/d56/group__text__detect.html',1,'Scene Text Detection']]], + ['detection_27',['detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'DNN used for object detection'],['https://docs.opencv.org/4.2.0/d4/d54/group__xobjdetect.html',1,'Extended object detection'],['https://docs.opencv.org/4.2.0/de/d51/group__ximgproc__edge.html',1,'Structured forests for fast edge detection']]], + ['detection_20and_20description_28',['Detection and Description',['https://docs.opencv.org/4.2.0/d5/d51/group__features2d__main.html',1,'Feature Detection and Description'],['https://docs.opencv.org/4.2.0/d6/d1d/group__cudafeatures2d.html',1,'Feature Detection and Description']]], + ['detection_20and_20recognition_29',['Scene Text Detection and Recognition',['https://docs.opencv.org/4.2.0/d4/d61/group__text.html',1,'']]], + ['detector_30',['Fast line detector',['https://docs.opencv.org/4.2.0/df/ded/group__ximgproc__fast__line__detector.html',1,'']]], + ['device_20layer_31',['Device layer',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html',1,'']]], + ['diagnostics_32',['Diagnostics',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01473.html',1,'']]], + ['difference_33',['Element-wise absolute difference',['https://docs.opencv.org/4.2.0/d5/dec/group__core__hal__interface__absdiff.html',1,'']]], + ['different_20datasets_34',['Framework for working with different datasets',['https://docs.opencv.org/4.2.0/d8/d00/group__datasets.html',1,'']]], + ['different_20image_20hashing_20algorithms_35',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], + ['dimensional_20spaces_36',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], + ['directx_20interoperability_37',['DirectX interoperability',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html',1,'']]], + ['distance_20and_20matching_38',['Shape Distance and Matching',['https://docs.opencv.org/4.2.0/d1/d85/group__shape.html',1,'']]], + ['distributions_39',['Distributions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01545.html',1,'Bernoulli Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01544.html',1,'Normal Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01546.html',1,'Poisson Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01542.html',1,'Random Number Distributions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01543.html',1,'Uniform Distributions']]], + ['divide_40',['Element-wise divide',['https://docs.opencv.org/4.2.0/dd/d2c/group__core__hal__interface__divide.html',1,'']]], + ['dnn_20used_20for_20object_20detection_41',['DNN used for object detection',['https://docs.opencv.org/4.2.0/d5/df6/group__dnn__objdetect.html',1,'']]], + ['dnn_20used_20for_20super_20resolution_42',['DNN used for super resolution',['https://docs.opencv.org/4.2.0/d9/de0/group__dnn__superres.html',1,'']]], + ['drawing_20and_20composition_20functionality_43',['G-API Drawing and composition functionality',['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'']]], + ['drawing_20function_20of_20keypoints_20and_20matches_44',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], + ['drawing_20functions_45',['Drawing Functions',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html',1,'']]], + ['drawing_20operations_20and_20functions_46',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], + ['drawing_20primitives_47',['Drawing primitives',['https://docs.opencv.org/4.2.0/de/db8/group__gapi__draw__prims.html',1,'']]], + ['drawing_20utf_208_20strings_20with_20freetype_20harfbuzz_48',['Drawing UTF-8 strings with freetype/harfbuzz',['https://docs.opencv.org/4.2.0/d4/dfc/group__freetype.html',1,'']]], + ['dynamic_20bitset_49',['Dynamic Bitset.',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01519.html',1,'']]] ]; diff --git a/search/groups_9.js b/search/groups_9.js index 2c312585..368ecad0 100644 --- a/search/groups_9.js +++ b/search/groups_9.js @@ -64,18 +64,12 @@ var searchData= ['function_20objects_61',['Function Objects',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01505.html',1,'']]], ['function_20of_20keypoints_20and_20matches_62',['Drawing Function of Keypoints and Matches',['https://docs.opencv.org/4.2.0/d4/d5d/group__features2d__draw.html',1,'']]], ['functionality_63',['functionality',['https://docs.opencv.org/4.2.0/d0/de1/group__core.html',1,'Core functionality'],['https://docs.opencv.org/4.2.0/df/d1f/group__gapi__core.html',1,'G-API Core functionality'],['https://docs.opencv.org/4.2.0/df/de4/group__gapi__draw.html',1,'G-API Drawing and composition functionality'],['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'G-API Image processing functionality']]], - ['functions_64',['functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html',1,'Adaptors for pointers to functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01523.html',1,'Array creation functions'],['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'Catalog of coefficient-wise math functions']]], - ['functions_65',['Drawing Functions',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html',1,'']]], - ['functions_66',['Drawing operations and functions',['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'']]], - ['functions_67',['Functions',['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html',1,'Functions'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html',1,'Functions']]], - ['functions_68',['Graph API: Image and channel composition functions',['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'']]], - ['functions_69',['Functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html',1,'Mathematical Special Functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html',1,'Mathematical Special Functions']]], - ['functions_70',['Passing Eigen objects by value to functions',['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'']]], - ['functions_71',['Qt New Functions',['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html',1,'']]], - ['functions_20and_20macros_72',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], - ['functions_20for_20opencv_20samples_73',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]], - ['fundamental_74',['Fundamental',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html',1,'']]], - ['futures_75',['Futures',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html',1,'']]], - ['fuzzy_20image_20processing_76',['Fuzzy image processing',['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html',1,'']]], - ['fuzzy_20mathematics_77',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]] + ['functions_64',['Functions',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html',1,'Drawing Functions'],['https://docs.opencv.org/4.2.0/d3/ddd/group__core__hal__functions.html',1,'Functions'],['https://docs.opencv.org/4.2.0/d5/df1/group__imgproc__hal__functions.html',1,'Functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01503.html',1,'Mathematical Special Functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01518.html',1,'Mathematical Special Functions'],['https://docs.opencv.org/4.2.0/dc/d46/group__highgui__qt.html',1,'Qt New Functions']]], + ['functions_65',['functions',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01510.html',1,'Adaptors for pointers to functions'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01523.html',1,'Array creation functions'],['https://eigen.tuxfamily.org/dox/group__CoeffwiseMathFunctions.html',1,'Catalog of coefficient-wise math functions'],['https://docs.opencv.org/4.2.0/d0/d43/group__gapi__draw__api.html',1,'Drawing operations and functions'],['https://docs.opencv.org/4.2.0/d6/d91/group__gapi__transform.html',1,'Graph API: Image and channel composition functions'],['https://eigen.tuxfamily.org/dox/group__TopicPassingByValue.html',1,'Passing Eigen objects by value to functions']]], + ['functions_20and_20macros_66',['Utility and system functions and macros',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html',1,'']]], + ['functions_20for_20opencv_20samples_67',['Utility functions for OpenCV samples',['https://docs.opencv.org/4.2.0/d6/dba/group__core__utils__samples.html',1,'']]], + ['fundamental_68',['Fundamental',['https://docs.opencv.org/4.2.0/d7/d15/group__fundamental.html',1,'']]], + ['futures_69',['Futures',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01478.html',1,'']]], + ['fuzzy_20image_20processing_70',['Fuzzy image processing',['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html',1,'']]], + ['fuzzy_20mathematics_71',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]] ]; diff --git a/search/groups_c.js b/search/groups_c.js index b4d7068d..43231492 100644 --- a/search/groups_c.js +++ b/search/groups_c.js @@ -12,52 +12,51 @@ var searchData= ['image_20filters_9',['Graph API: Image filters',['https://docs.opencv.org/4.2.0/da/dc5/group__gapi__filters.html',1,'']]], ['image_20from_20one_20color_20space_20to_20another_10',['Graph API: Converting image from one color space to another',['https://docs.opencv.org/4.2.0/dc/d38/group__gapi__colorconvert.html',1,'']]], ['image_20hashing_20algorithms_11',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], - ['image_20processing_12',['Extended Image Processing',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html',1,'']]], + ['image_20processing_12',['Image Processing',['https://docs.opencv.org/4.2.0/df/d2d/group__ximgproc.html',1,'Extended Image Processing'],['https://docs.opencv.org/4.2.0/d7/dbd/group__imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html',1,'NPPST Image Processing']]], ['image_20processing_13',['Fuzzy image processing',['https://docs.opencv.org/4.2.0/d1/dfc/group__f__image.html',1,'']]], - ['image_20processing_14',['Image Processing',['https://docs.opencv.org/4.2.0/d7/dbd/group__imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d0/d05/group__cudaimgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html',1,'NPPST Image Processing']]], - ['image_20processing_20based_20on_20fuzzy_20mathematics_15',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], - ['image_20processing_20functionality_16',['G-API Image processing functionality',['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'']]], - ['image_20quality_20analysis_20iqa_20api_17',['Image Quality Analysis (IQA) API',['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'']]], - ['image_20registration_18',['Image Registration',['https://docs.opencv.org/4.2.0/dc/def/group__datasets__ir.html',1,'Image Registration'],['https://docs.opencv.org/4.2.0/db/d61/group__reg.html',1,'Image Registration']]], - ['image_20segmentation_19',['Image Segmentation',['https://docs.opencv.org/4.2.0/dc/d29/group__hfs.html',1,'Hierarchical Feature Selection for Efficient Image Segmentation'],['https://docs.opencv.org/4.2.0/d3/d2d/group__datasets__is.html',1,'Image Segmentation']]], - ['image_20segmentation_20',['Image segmentation',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html',1,'']]], - ['image_20transformations_21',['Image Transformations',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html',1,'Geometric Image Transformations'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html',1,'Miscellaneous Image Transformations']]], - ['image_20warping_22',['Image Warping',['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html',1,'']]], - ['images_20matching_23',['Features Finding and Images Matching',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'']]], - ['images_20stitching_24',['Images stitching',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html',1,'']]], - ['images_20warping_25',['Images Warping',['https://docs.opencv.org/4.2.0/d0/dfa/group__stitching__warp.html',1,'']]], - ['imaging_26',['HDR imaging',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html',1,'']]], - ['implementation_20classes_27',['Implementation Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01501.html',1,'Base and Implementation Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01497.html',1,'Base and Implementation Classes']]], - ['implementation_20helpers_28',['Private implementation helpers',['https://docs.opencv.org/4.2.0/dd/d96/group__core__hal__intrin__impl.html',1,'']]], - ['implementations_20of_20different_20image_20hashing_20algorithms_29',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], - ['implemented_20layers_30',['Partial List of Implemented Layers',['https://docs.opencv.org/4.2.0/d6/d87/group__dnnLayerList.html',1,'']]], - ['improved_20background_20foreground_20segmentation_20methods_31',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], - ['in_20multi_20dimensional_20spaces_32',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], - ['in_20opencv_33',['ColorMaps in OpenCV',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html',1,'']]], - ['indexing_34',['Slicing and Indexing',['https://eigen.tuxfamily.org/dox/group__TutorialSlicingIndexing.html',1,'']]], - ['information_35',['Initialization and Information',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html',1,'']]], - ['initialization_36',['Advanced initialization',['https://eigen.tuxfamily.org/dox/group__TutorialAdvancedInitialization.html',1,'']]], - ['initialization_20and_20information_37',['Initialization and Information',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html',1,'']]], - ['inpainting_38',['Inpainting',['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html',1,'']]], - ['inplace_20matrix_20decompositions_39',['Inplace matrix decompositions',['https://eigen.tuxfamily.org/dox/group__InplaceDecomposition.html',1,'']]], - ['input_20output_40',['Input/Output',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html',1,'']]], - ['inspired_20vision_20models_20and_20derivated_20tools_41',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], - ['intel_20ipp_20asynchronous_20c_20c_20converters_42',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], - ['intel_20va_20api_20opencl_20cl_20va_20interoperability_43',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], - ['interactive_20visual_20debugging_20of_20computer_20vision_20programs_44',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], - ['interface_45',['Interface',['https://docs.opencv.org/4.2.0/d1/d1b/group__core__hal__interface.html',1,'Interface'],['https://docs.opencv.org/4.2.0/dd/d8b/group__imgproc__hal__interface.html',1,'Interface'],['https://docs.opencv.org/4.2.0/db/d47/group__features2d__hal__interface.html',1,'Interface']]], - ['interfacing_20with_20raw_20buffers_3a_20the_20map_20class_46',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], - ['interoperability_47',['interoperability',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html',1,'DirectX interoperability'],['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'Intel VA-API/OpenCL (CL-VA) interoperability'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html',1,'OpenGL interoperability']]], - ['intrinsics_48',['Universal intrinsics',['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html',1,'']]], - ['invalidation_20guarantees_49',['Invalidation Guarantees',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01538.html',1,'']]], - ['inverse_20square_20root_20calculation_50',['Inverse square root calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'']]], - ['ios_20glue_51',['iOS glue',['https://docs.opencv.org/4.2.0/d2/d92/group__imgcodecs__ios.html',1,'']]], - ['ios_20glue_20for_20video_20i_20o_52',['iOS glue for video I/O',['https://docs.opencv.org/4.2.0/d5/d26/group__videoio__ios.html',1,'']]], - ['ipp_20asynchronous_20c_20c_20converters_53',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], - ['iqa_20api_54',['Image Quality Analysis (IQA) API',['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'']]], - ['issues_55',['Alignment issues',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__Alignement.html',1,'']]], - ['iterativelinearsolvers_20module_56',['IterativeLinearSolvers module',['https://eigen.tuxfamily.org/dox/group__IterativeLinearSolvers__Module.html',1,'']]], - ['iterator_20tags_57',['Iterator Tags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01514.html',1,'']]], - ['iterators_58',['Iterators',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html',1,'']]], - ['iterators_20and_20algorithms_59',['STL iterators and algorithms',['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'']]] + ['image_20processing_20based_20on_20fuzzy_20mathematics_14',['Image processing based on fuzzy mathematics',['https://docs.opencv.org/4.2.0/df/d5b/group__fuzzy.html',1,'']]], + ['image_20processing_20functionality_15',['G-API Image processing functionality',['https://docs.opencv.org/4.2.0/d2/d00/group__gapi__imgproc.html',1,'']]], + ['image_20quality_20analysis_20iqa_20api_16',['Image Quality Analysis (IQA) API',['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'']]], + ['image_20registration_17',['Image Registration',['https://docs.opencv.org/4.2.0/dc/def/group__datasets__ir.html',1,'Image Registration'],['https://docs.opencv.org/4.2.0/db/d61/group__reg.html',1,'Image Registration']]], + ['image_20segmentation_18',['Image Segmentation',['https://docs.opencv.org/4.2.0/dc/d29/group__hfs.html',1,'Hierarchical Feature Selection for Efficient Image Segmentation'],['https://docs.opencv.org/4.2.0/d3/d2d/group__datasets__is.html',1,'Image Segmentation']]], + ['image_20segmentation_19',['Image segmentation',['https://docs.opencv.org/4.2.0/d5/df0/group__ximgproc__segmentation.html',1,'']]], + ['image_20transformations_20',['Image Transformations',['https://docs.opencv.org/4.2.0/da/d54/group__imgproc__transform.html',1,'Geometric Image Transformations'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html',1,'Miscellaneous Image Transformations']]], + ['image_20warping_21',['Image Warping',['https://docs.opencv.org/4.2.0/db/d29/group__cudawarping.html',1,'']]], + ['images_20matching_22',['Features Finding and Images Matching',['https://docs.opencv.org/4.2.0/df/d8c/group__stitching__match.html',1,'']]], + ['images_20stitching_23',['Images stitching',['https://docs.opencv.org/4.2.0/d1/d46/group__stitching.html',1,'']]], + ['images_20warping_24',['Images Warping',['https://docs.opencv.org/4.2.0/d0/dfa/group__stitching__warp.html',1,'']]], + ['imaging_25',['HDR imaging',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html',1,'']]], + ['implementation_20classes_26',['Implementation Classes',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01501.html',1,'Base and Implementation Classes'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01497.html',1,'Base and Implementation Classes']]], + ['implementation_20helpers_27',['Private implementation helpers',['https://docs.opencv.org/4.2.0/dd/d96/group__core__hal__intrin__impl.html',1,'']]], + ['implementations_20of_20different_20image_20hashing_20algorithms_28',['The module brings implementations of different image hashing algorithms.',['https://docs.opencv.org/4.2.0/d4/d93/group__img__hash.html',1,'']]], + ['implemented_20layers_29',['Partial List of Implemented Layers',['https://docs.opencv.org/4.2.0/d6/d87/group__dnnLayerList.html',1,'']]], + ['improved_20background_20foreground_20segmentation_20methods_30',['Improved Background-Foreground Segmentation Methods',['https://docs.opencv.org/4.2.0/d2/d55/group__bgsegm.html',1,'']]], + ['in_20multi_20dimensional_20spaces_31',['Clustering and Search in Multi-Dimensional Spaces',['https://docs.opencv.org/4.2.0/dc/de5/group__flann.html',1,'']]], + ['in_20opencv_32',['ColorMaps in OpenCV',['https://docs.opencv.org/4.2.0/d3/d50/group__imgproc__colormap.html',1,'']]], + ['indexing_33',['Slicing and Indexing',['https://eigen.tuxfamily.org/dox/group__TutorialSlicingIndexing.html',1,'']]], + ['information_34',['Initialization and Information',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html',1,'']]], + ['initialization_35',['Advanced initialization',['https://eigen.tuxfamily.org/dox/group__TutorialAdvancedInitialization.html',1,'']]], + ['initialization_20and_20information_36',['Initialization and Information',['https://docs.opencv.org/4.2.0/d8/d40/group__cudacore__init.html',1,'']]], + ['inpainting_37',['Inpainting',['https://docs.opencv.org/4.2.0/d7/d8b/group__photo__inpaint.html',1,'']]], + ['inplace_20matrix_20decompositions_38',['Inplace matrix decompositions',['https://eigen.tuxfamily.org/dox/group__InplaceDecomposition.html',1,'']]], + ['input_20output_39',['Input/Output',['https://docs.opencv.org/4.2.0/d2/da3/group__io.html',1,'']]], + ['inspired_20vision_20models_20and_20derivated_20tools_40',['Biologically inspired vision models and derivated tools',['https://docs.opencv.org/4.2.0/dd/deb/group__bioinspired.html',1,'']]], + ['intel_20ipp_20asynchronous_20c_20c_20converters_41',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], + ['intel_20va_20api_20opencl_20cl_20va_20interoperability_42',['Intel VA-API/OpenCL (CL-VA) interoperability',['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'']]], + ['interactive_20visual_20debugging_20of_20computer_20vision_20programs_43',['GUI for Interactive Visual Debugging of Computer Vision Programs',['https://docs.opencv.org/4.2.0/df/dff/group__cvv.html',1,'']]], + ['interface_44',['Interface',['https://docs.opencv.org/4.2.0/d1/d1b/group__core__hal__interface.html',1,'Interface'],['https://docs.opencv.org/4.2.0/dd/d8b/group__imgproc__hal__interface.html',1,'Interface'],['https://docs.opencv.org/4.2.0/db/d47/group__features2d__hal__interface.html',1,'Interface']]], + ['interfacing_20with_20raw_20buffers_3a_20the_20map_20class_45',['Interfacing with raw buffers: the Map class',['https://eigen.tuxfamily.org/dox/group__TutorialMapClass.html',1,'']]], + ['interoperability_46',['interoperability',['https://docs.opencv.org/4.2.0/de/dc1/group__core__directx.html',1,'DirectX interoperability'],['https://docs.opencv.org/4.2.0/d1/daa/group__core__va__intel.html',1,'Intel VA-API/OpenCL (CL-VA) interoperability'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html',1,'OpenGL interoperability']]], + ['intrinsics_47',['Universal intrinsics',['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html',1,'']]], + ['invalidation_20guarantees_48',['Invalidation Guarantees',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01538.html',1,'']]], + ['inverse_20square_20root_20calculation_49',['Inverse square root calculation',['https://docs.opencv.org/4.2.0/d0/d5d/group__core__hal__interface__invSqrt.html',1,'']]], + ['ios_20glue_50',['iOS glue',['https://docs.opencv.org/4.2.0/d2/d92/group__imgcodecs__ios.html',1,'']]], + ['ios_20glue_20for_20video_20i_20o_51',['iOS glue for video I/O',['https://docs.opencv.org/4.2.0/d5/d26/group__videoio__ios.html',1,'']]], + ['ipp_20asynchronous_20c_20c_20converters_52',['Intel IPP Asynchronous C/C++ Converters',['https://docs.opencv.org/4.2.0/d6/dcf/group__core__ipp.html',1,'']]], + ['iqa_20api_53',['Image Quality Analysis (IQA) API',['https://docs.opencv.org/4.2.0/dc/d20/group__quality.html',1,'']]], + ['issues_54',['Alignment issues',['https://eigen.tuxfamily.org/dox/group__DenseMatrixManipulation__Alignement.html',1,'']]], + ['iterativelinearsolvers_20module_55',['IterativeLinearSolvers module',['https://eigen.tuxfamily.org/dox/group__IterativeLinearSolvers__Module.html',1,'']]], + ['iterator_20tags_56',['Iterator Tags',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01514.html',1,'']]], + ['iterators_57',['Iterators',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01513.html',1,'']]], + ['iterators_20and_20algorithms_58',['STL iterators and algorithms',['https://eigen.tuxfamily.org/dox/group__TutorialSTL.html',1,'']]] ]; diff --git a/search/groups_f.js b/search/groups_f.js index 3f1170a1..38aa58c2 100644 --- a/search/groups_f.js +++ b/search/groups_f.js @@ -1,7 +1,7 @@ var searchData= [ - ['layer_0',['Device layer',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html',1,'']]], - ['layer_1',['Layer',['https://docs.opencv.org/4.2.0/de/d85/group__core__hal.html',1,'Hardware Acceleration Layer'],['https://docs.opencv.org/4.2.0/d3/df3/group__imgproc__hal.html',1,'Hardware Acceleration Layer'],['https://docs.opencv.org/4.2.0/d8/d45/group__feature2d__hal.html',1,'Hardware Acceleration Layer']]], + ['layer_0',['Layer',['https://docs.opencv.org/4.2.0/de/d85/group__core__hal.html',1,'Hardware Acceleration Layer'],['https://docs.opencv.org/4.2.0/d3/df3/group__imgproc__hal.html',1,'Hardware Acceleration Layer'],['https://docs.opencv.org/4.2.0/d8/d45/group__feature2d__hal.html',1,'Hardware Acceleration Layer']]], + ['layer_1',['Device layer',['https://docs.opencv.org/4.2.0/df/dfc/group__cudev.html',1,'']]], ['layers_2',['Partial List of Implemented Layers',['https://docs.opencv.org/4.2.0/d6/d87/group__dnnLayerList.html',1,'']]], ['layers_20registration_3',['Utilities for New Layers Registration',['https://docs.opencv.org/4.2.0/df/dc1/group__dnnLayerFactory.html',1,'']]], ['learning_4',['Machine Learning',['https://docs.opencv.org/4.2.0/dd/ded/group__ml.html',1,'']]], diff --git a/search/pages_0.js b/search/pages_0.js index 86d8ba92..d4c41986 100644 --- a/search/pages_0.js +++ b/search/pages_0.js @@ -1,6 +1,7 @@ var searchData= [ - ['1_20_3a_20find_20plot_20analyze_0',['1 : Find Plot Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], - ['1_20and_20cmake_20version_203_209_201_1',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], - ['14_201_20and_20cmake_20version_203_209_201_2',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]] + ['1_0',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['1_20_3a_20find_20plot_20analyze_1',['1 : Find Plot Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], + ['1_20and_20cmake_20version_203_209_201_2',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['14_201_20and_20cmake_20version_203_209_201_3',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]] ]; diff --git a/search/pages_12.js b/search/pages_12.js index 2fbeb8bb..cdd8a5f5 100644 --- a/search/pages_12.js +++ b/search/pages_12.js @@ -17,8 +17,8 @@ var searchData= ['mask_20operations_20on_20matrices_14',['Mask operations on matrices',['https://docs.opencv.org/4.2.0/d7/d37/tutorial_mat_mask_operations.html',1,'']]], ['master_20installation_20by_20using_20git_20bash_20version_202_2014_201_20and_20cmake_20version_203_209_201_15',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], ['mat_20the_20basic_20image_20container_16',['Mat - The Basic Image Container',['https://docs.opencv.org/4.2.0/d6/d6d/tutorial_mat_the_basic_image_container.html',1,'']]], - ['matching_17',['AKAZE local features matching',['https://docs.opencv.org/4.2.0/db/d70/tutorial_akaze_matching.html',1,'']]], - ['matching_18',['Matching',['https://docs.opencv.org/4.2.0/dc/dc3/tutorial_py_matcher.html',1,'Feature Matching'],['https://docs.opencv.org/4.2.0/de/da9/tutorial_template_matching.html',1,'Template Matching'],['https://docs.opencv.org/4.2.0/d4/dc6/tutorial_py_template_matching.html',1,'Template Matching'],['https://docs.opencv.org/4.2.0/d8/dd1/tutorial_js_template_matching.html',1,'Template Matching']]], + ['matching_17',['Matching',['https://docs.opencv.org/4.2.0/dc/dc3/tutorial_py_matcher.html',1,'Feature Matching'],['https://docs.opencv.org/4.2.0/de/da9/tutorial_template_matching.html',1,'Template Matching'],['https://docs.opencv.org/4.2.0/d4/dc6/tutorial_py_template_matching.html',1,'Template Matching'],['https://docs.opencv.org/4.2.0/d8/dd1/tutorial_js_template_matching.html',1,'Template Matching']]], + ['matching_18',['AKAZE local features matching',['https://docs.opencv.org/4.2.0/db/d70/tutorial_akaze_matching.html',1,'']]], ['matching_20homography_20to_20find_20objects_19',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], ['matching_20with_20flann_20',['Feature Matching with FLANN',['https://docs.opencv.org/4.2.0/d5/d6f/tutorial_feature_flann_matcher.html',1,'']]], ['matrices_21',['Mask operations on matrices',['https://docs.opencv.org/4.2.0/d7/d37/tutorial_mat_mask_operations.html',1,'']]], diff --git a/search/pages_14.js b/search/pages_14.js index a36afc84..b5a04fcd 100644 --- a/search/pages_14.js +++ b/search/pages_14.js @@ -8,8 +8,8 @@ var searchData= ['object_20detection_5',['Object Detection',['https://docs.opencv.org/4.2.0/d9/de5/tutorial_py_table_of_contents_objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/dc/d73/tutorial_js_table_of_contents_objdetect.html',1,'Object Detection']]], ['object_20detection_20objdetect_20module_6',['Object Detection (objdetect module)',['https://docs.opencv.org/4.2.0/d2/d64/tutorial_table_of_content_objdetect.html',1,'']]], ['object_20detection_20using_20cnns_7',['Object Detection using CNNs',['https://docs.opencv.org/4.2.0/d2/da2/tutorial_dnn_objdetect.html',1,'']]], - ['objects_8',['Detection of planar objects',['https://docs.opencv.org/4.2.0/dd/dd4/tutorial_detection_of_planar_objects.html',1,'']]], - ['objects_9',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], + ['objects_8',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], + ['objects_9',['Detection of planar objects',['https://docs.opencv.org/4.2.0/dd/dd4/tutorial_detection_of_planar_objects.html',1,'']]], ['ocr_20of_20hand_20written_20data_20using_20knn_10',['OCR of Hand-written Data using kNN',['https://docs.opencv.org/4.2.0/d8/d4b/tutorial_py_knn_opencv.html',1,'']]], ['ocr_20of_20hand_20written_20data_20using_20svm_11',['OCR of Hand-written Data using SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'']]], ['of_20a_20textured_20object_12',['Real Time pose estimation of a textured object',['https://docs.opencv.org/4.2.0/dc/d2c/tutorial_real_time_pose.html',1,'']]], @@ -90,9 +90,8 @@ var searchData= ['output_20imgcodecs_20module_87',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], ['output_20using_20xml_20and_20yaml_20files_88',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], ['output_20videoio_20module_89',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], - ['overview_90',['G-API Overview',['https://docs.opencv.org/4.2.0/db/d87/md_gapi_doc_slides_README.html',1,'']]], + ['overview_90',['Overview',['https://docs.opencv.org/4.2.0/db/d87/md_gapi_doc_slides_README.html',1,'G-API Overview'],['https://docs.opencv.org/4.2.0/dc/dd6/ml_intro.html',1,'Machine Learning Overview'],['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'Video I/O with OpenCV Overview']]], ['overview_91',['High-level design overview',['https://docs.opencv.org/4.2.0/de/d4d/gapi_hld.html',1,'']]], - ['overview_92',['Overview',['https://docs.opencv.org/4.2.0/dc/dd6/ml_intro.html',1,'Machine Learning Overview'],['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'Video I/O with OpenCV Overview']]], - ['own_20corner_20detector_93',['Creating your own corner detector',['https://docs.opencv.org/4.2.0/d9/dbc/tutorial_generic_corner_detector.html',1,'']]], - ['own_20linear_20filters_94',['Making your own linear filters!',['https://docs.opencv.org/4.2.0/d4/dbd/tutorial_filter_2d.html',1,'']]] + ['own_20corner_20detector_92',['Creating your own corner detector',['https://docs.opencv.org/4.2.0/d9/dbc/tutorial_generic_corner_detector.html',1,'']]], + ['own_20linear_20filters_93',['Making your own linear filters!',['https://docs.opencv.org/4.2.0/d4/dbd/tutorial_filter_2d.html',1,'']]] ]; diff --git a/search/pages_15.js b/search/pages_15.js index 95b4b758..165ecc06 100644 --- a/search/pages_15.js +++ b/search/pages_15.js @@ -37,8 +37,8 @@ var searchData= ['preprocessor_20directives_34',['Preprocessor directives',['https://eigen.tuxfamily.org/dox/TopicPreprocessorDirectives.html',1,'']]], ['preview_20based_20cv_20application_35',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], ['principal_20component_20analysis_20pca_36',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], - ['processing_37',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], - ['processing_38',['Processing',['https://docs.opencv.org/4.2.0/d2/df0/tutorial_js_table_of_contents_imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'OpenCV iOS - Image Processing'],['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'OpenCV iOS - Video Processing']]], + ['processing_37',['Processing',['https://docs.opencv.org/4.2.0/d2/df0/tutorial_js_table_of_contents_imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'OpenCV iOS - Image Processing'],['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'OpenCV iOS - Video Processing']]], + ['processing_38',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], ['processing_20for_20video_20capture_39',['Image Processing for Video Capture',['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'']]], ['processing_20images_20causing_20optical_20illusions_40',['Processing images causing optical illusions',['https://docs.opencv.org/4.2.0/d7/d8f/tutorial_bioinspired_retina_illusion.html',1,'']]], ['processing_20imgproc_20module_41',['Image Processing (imgproc module)',['https://docs.opencv.org/4.2.0/d7/da8/tutorial_table_of_content_imgproc.html',1,'']]], @@ -46,8 +46,8 @@ var searchData= ['processing_20tutorials_43',['Fuzzy image processing tutorials',['https://docs.opencv.org/4.2.0/d7/d36/tutorial_fuzzy.html',1,'']]], ['product_20expressions_44',['Writing efficient matrix product expressions',['https://eigen.tuxfamily.org/dox/TopicWritingEfficientProductExpression.html',1,'']]], ['projection_45',['Back Projection',['https://docs.opencv.org/4.2.0/da/d7f/tutorial_back_projection.html',1,'']]], - ['projects_46',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], - ['projects_47',['Using Eigen in CMake Projects',['https://eigen.tuxfamily.org/dox/TopicCMakeGuide.html',1,'']]], + ['projects_46',['Using Eigen in CMake Projects',['https://eigen.tuxfamily.org/dox/TopicCMakeGuide.html',1,'']]], + ['projects_47',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], ['properties_48',['Properties',['https://docs.opencv.org/4.2.0/d1/d32/tutorial_py_contour_properties.html',1,'Contour Properties'],['https://docs.opencv.org/4.2.0/da/dc1/tutorial_js_contour_properties.html',1,'Contour Properties']]], ['pyramids_49',['Pyramids',['https://docs.opencv.org/4.2.0/d4/d1f/tutorial_pyramids.html',1,'Image Pyramids'],['https://docs.opencv.org/4.2.0/dc/dff/tutorial_py_pyramids.html',1,'Image Pyramids'],['https://docs.opencv.org/4.2.0/d5/d0f/tutorial_js_pyramids.html',1,'Image Pyramids']]], ['python_20bindings_50',['OpenCV-Python Bindings',['https://docs.opencv.org/4.2.0/df/da2/tutorial_py_table_of_contents_bindings.html',1,'']]], diff --git a/search/pages_18.js b/search/pages_18.js index 2ffdc4f1..ffe29a44 100644 --- a/search/pages_18.js +++ b/search/pages_18.js @@ -41,27 +41,28 @@ var searchData= ['stereo_20stereo_20module_38',['Quasi Dense Stereo (stereo module)',['https://docs.opencv.org/4.2.0/d9/d58/tutorial_table_of_content_quasi_dense_stereo.html',1,'']]], ['stitcher_20class_39',['High level stitching API (Stitcher class)',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'']]], ['stitching_20api_20stitcher_20class_40',['High level stitching API (Stitcher class)',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'']]], - ['stitching_20stitching_20module_41',['Images stitching (stitching module)',['https://docs.opencv.org/4.2.0/d0/d33/tutorial_table_of_content_stitching.html',1,'']]], - ['structure_20from_20motion_42',['Structure From Motion',['https://docs.opencv.org/4.2.0/de/d7c/tutorial_table_of_content_sfm.html',1,'']]], - ['structure_20tensor_43',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], - ['structured_20forest_20training_44',['Structured forest training',['https://docs.opencv.org/4.2.0/d2/d59/tutorial_ximgproc_training.html',1,'']]], - ['structured_20forests_20for_20fast_20edge_20detection_45',['Structured forests for fast edge detection',['https://docs.opencv.org/4.2.0/d0/da5/tutorial_ximgproc_prediction.html',1,'']]], - ['structured_20light_20tutorials_46',['Structured Light tutorials',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_structured_light.html',1,'']]], - ['structures_47',['Some Data Structures',['https://docs.opencv.org/4.2.0/d5/df1/tutorial_js_some_data_structures.html',1,'']]], - ['studio_48',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['studio_20debugger_49',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['style_20guide_50',['Style Guide',['../md_StyleGuide.html',1,'']]], - ['subpixels_51',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], - ['subtraction_52',['Subtraction',['https://docs.opencv.org/4.2.0/db/d5c/tutorial_py_bg_subtraction.html',1,'Background Subtraction'],['https://docs.opencv.org/4.2.0/de/df4/tutorial_js_bg_subtraction.html',1,'Background Subtraction'],['https://docs.opencv.org/4.2.0/d8/d38/tutorial_bgsegm_bg_subtraction.html',1,'Background Subtraction']]], - ['subtraction_20methods_53',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], - ['super_20resolution_20benchmarking_54',['Super-resolution benchmarking',['https://docs.opencv.org/4.2.0/dc/d69/tutorial_dnn_superres_benchmark.html',1,'']]], - ['super_20resolution_20using_20cnns_55',['Super Resolution using CNNs',['https://docs.opencv.org/4.2.0/d8/df8/tutorial_table_of_content_dnn_superres.html',1,'']]], - ['support_56',['Custom deep learning layers support',['https://docs.opencv.org/4.2.0/dc/db1/tutorial_dnn_custom_layers.html',1,'']]], - ['support_20vector_20machines_57',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], - ['support_20vector_20machines_20for_20non_20linearly_20separable_20data_58',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], - ['support_20vector_20machines_20svm_59',['Support Vector Machines (SVM)',['https://docs.opencv.org/4.2.0/d3/d02/tutorial_py_svm_index.html',1,'']]], - ['surf_20speeded_20up_20robust_20features_60',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], - ['svm_61',['SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'OCR of Hand-written Data using SVM'],['https://docs.opencv.org/4.2.0/d3/d02/tutorial_py_svm_index.html',1,'Support Vector Machines (SVM)'],['https://docs.opencv.org/4.2.0/d4/db1/tutorial_py_svm_basics.html',1,'Understanding SVM']]], - ['swapping_20using_20face_20landmark_20detection_62',['Face swapping using face landmark detection',['https://docs.opencv.org/4.2.0/d1/d52/tutorial_face_swapping_face_landmark_detection.html',1,'']]], - ['systems_63',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]] + ['stitching_20module_41',['Images stitching (stitching module)',['https://docs.opencv.org/4.2.0/d0/d33/tutorial_table_of_content_stitching.html',1,'']]], + ['stitching_20stitching_20module_42',['Images stitching (stitching module)',['https://docs.opencv.org/4.2.0/d0/d33/tutorial_table_of_content_stitching.html',1,'']]], + ['structure_20from_20motion_43',['Structure From Motion',['https://docs.opencv.org/4.2.0/de/d7c/tutorial_table_of_content_sfm.html',1,'']]], + ['structure_20tensor_44',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], + ['structured_20forest_20training_45',['Structured forest training',['https://docs.opencv.org/4.2.0/d2/d59/tutorial_ximgproc_training.html',1,'']]], + ['structured_20forests_20for_20fast_20edge_20detection_46',['Structured forests for fast edge detection',['https://docs.opencv.org/4.2.0/d0/da5/tutorial_ximgproc_prediction.html',1,'']]], + ['structured_20light_20tutorials_47',['Structured Light tutorials',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_structured_light.html',1,'']]], + ['structures_48',['Some Data Structures',['https://docs.opencv.org/4.2.0/d5/df1/tutorial_js_some_data_structures.html',1,'']]], + ['studio_49',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['studio_20debugger_50',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['style_20guide_51',['Style Guide',['../md_StyleGuide.html',1,'']]], + ['subpixels_52',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], + ['subtraction_53',['Subtraction',['https://docs.opencv.org/4.2.0/db/d5c/tutorial_py_bg_subtraction.html',1,'Background Subtraction'],['https://docs.opencv.org/4.2.0/de/df4/tutorial_js_bg_subtraction.html',1,'Background Subtraction'],['https://docs.opencv.org/4.2.0/d8/d38/tutorial_bgsegm_bg_subtraction.html',1,'Background Subtraction']]], + ['subtraction_20methods_54',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], + ['super_20resolution_20benchmarking_55',['Super-resolution benchmarking',['https://docs.opencv.org/4.2.0/dc/d69/tutorial_dnn_superres_benchmark.html',1,'']]], + ['super_20resolution_20using_20cnns_56',['Super Resolution using CNNs',['https://docs.opencv.org/4.2.0/d8/df8/tutorial_table_of_content_dnn_superres.html',1,'']]], + ['support_57',['Custom deep learning layers support',['https://docs.opencv.org/4.2.0/dc/db1/tutorial_dnn_custom_layers.html',1,'']]], + ['support_20vector_20machines_58',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], + ['support_20vector_20machines_20for_20non_20linearly_20separable_20data_59',['Support Vector Machines for Non-Linearly Separable Data',['https://docs.opencv.org/4.2.0/d0/dcc/tutorial_non_linear_svms.html',1,'']]], + ['support_20vector_20machines_20svm_60',['Support Vector Machines (SVM)',['https://docs.opencv.org/4.2.0/d3/d02/tutorial_py_svm_index.html',1,'']]], + ['surf_20speeded_20up_20robust_20features_61',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], + ['svm_62',['SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'OCR of Hand-written Data using SVM'],['https://docs.opencv.org/4.2.0/d3/d02/tutorial_py_svm_index.html',1,'Support Vector Machines (SVM)'],['https://docs.opencv.org/4.2.0/d4/db1/tutorial_py_svm_basics.html',1,'Understanding SVM']]], + ['swapping_20using_20face_20landmark_20detection_63',['Face swapping using face landmark detection',['https://docs.opencv.org/4.2.0/d1/d52/tutorial_face_swapping_face_landmark_detection.html',1,'']]], + ['systems_64',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]] ]; diff --git a/search/pages_19.js b/search/pages_19.js index b6d58c9a..2cc0b956 100644 --- a/search/pages_19.js +++ b/search/pages_19.js @@ -51,61 +51,57 @@ var searchData= ['to_20opencv_20python_20tutorials_48',['Introduction to OpenCV-Python Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'']]], ['to_20opencv_20tracker_49',['Introduction to OpenCV Tracker',['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'']]], ['to_20our_20applications_50',['Adding a Trackbar to our applications!',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'']]], - ['to_20principal_20component_20analysis_20pca_51',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], - ['to_20run_20deep_20networks_20in_20browser_52',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], - ['to_20run_20deep_20networks_20on_20android_20device_53',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], - ['to_20scan_20images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_54',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], - ['to_20schedule_20your_20network_20for_20halide_20backend_55',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], - ['to_20sift_20scale_20invariant_20feature_20transform_56',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], - ['to_20support_20vector_20machines_57',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], - ['to_20surf_20speeded_20up_20robust_20features_58',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], - ['to_20the_20facemark_20api_59',['Adding a new algorithm to the Facemark API',['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'']]], - ['to_20track_60',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], - ['to_20use_20background_20subtraction_20methods_61',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], - ['to_20use_20the_20opencv_20parallel_5ffor_5f_20to_20parallelize_20your_20code_62',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], - ['to_20your_20application_63',['Add a Trackbar to Your Application',['https://docs.opencv.org/4.2.0/d5/df3/tutorial_js_trackbar.html',1,'']]], - ['to_20your_20images_64',['Adding borders to your images',['https://docs.opencv.org/4.2.0/dc/da3/tutorial_copyMakeBorder.html',1,'']]], - ['tomasi_20corner_20detector_65',['Shi-Tomasi corner detector',['https://docs.opencv.org/4.2.0/d8/dd8/tutorial_good_features_to_track.html',1,'']]], - ['tomasi_20corner_20detector_20good_20features_20to_20track_66',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], - ['topics_67',['General topics',['https://eigen.tuxfamily.org/dox/UserManual_Generalities.html',1,'']]], - ['track_68',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], - ['trackbar_20as_20the_20color_20palette_69',['Trackbar as the Color Palette',['https://docs.opencv.org/4.2.0/d9/dc8/tutorial_py_trackbar.html',1,'']]], - ['trackbar_20to_20our_20applications_70',['Adding a Trackbar to our applications!',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'']]], - ['trackbar_20to_20your_20application_71',['Add a Trackbar to Your Application',['https://docs.opencv.org/4.2.0/d5/df3/tutorial_js_trackbar.html',1,'']]], - ['tracker_72',['Tracker',['https://docs.opencv.org/4.2.0/dc/db8/tutorial_customizing_cn_tracker.html',1,'Customizing the CN Tracker'],['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'Introduction to OpenCV Tracker']]], - ['tracking_73',['AKAZE and ORB planar tracking',['https://docs.opencv.org/4.2.0/dc/d16/tutorial_akaze_tracking.html',1,'']]], - ['training_74',['Cascade Classifier Training',['https://docs.opencv.org/4.2.0/dc/d88/tutorial_traincascade.html',1,'']]], - ['training_75',['Structured forest training',['https://docs.opencv.org/4.2.0/d2/d59/tutorial_ximgproc_training.html',1,'']]], - ['training_20data_20generation_20using_20icosphere_76',['Training data generation using Icosphere',['https://docs.opencv.org/4.2.0/d6/df4/tutorial_data_generation.html',1,'']]], - ['training_20model_20analysis_77',['Training Model Analysis',['https://docs.opencv.org/4.2.0/d8/d09/tutorial_model_analysis.html',1,'']]], - ['training_20the_20learning_20based_20white_20balance_20algorithm_78',['Training the learning-based white balance algorithm',['https://docs.opencv.org/4.2.0/dc/dcb/tutorial_xphoto_training_white_balance.html',1,'']]], - ['transform_79',['Discrete Fourier Transform',['https://docs.opencv.org/4.2.0/d8/d01/tutorial_discrete_fourier_transform.html',1,'']]], - ['transform_80',['Filtering using F-transform',['https://docs.opencv.org/4.2.0/d3/d1d/tutorial_fuzzy_filtering.html',1,'']]], - ['transform_81',['Transform',['https://docs.opencv.org/4.2.0/de/dbc/tutorial_py_fourier_transform.html',1,'Fourier Transform'],['https://docs.opencv.org/4.2.0/dd/d02/tutorial_js_fourier_transform.html',1,'Fourier Transform'],['https://docs.opencv.org/4.2.0/d4/d70/tutorial_hough_circle.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/da/d53/tutorial_py_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d3/de5/tutorial_js_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d9/db0/tutorial_hough_lines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d6/d10/tutorial_py_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d3/de6/tutorial_js_houghlines.html',1,'Hough Line Transform']]], - ['transform_82',['Inpainting using F-transform',['https://docs.opencv.org/4.2.0/d3/db8/tutorial_fuzzy_inpainting.html',1,'']]], - ['transform_83',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], - ['transform_20and_20watershed_20algorithm_84',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], - ['transform_20theory_85',['F-transform theory',['https://docs.opencv.org/4.2.0/db/daf/tutorial_fuzzy_theory.html',1,'']]], - ['transformations_86',['Transformations',['https://docs.opencv.org/4.2.0/d4/d61/tutorial_warp_affine.html',1,'Affine Transformations'],['https://docs.opencv.org/4.2.0/d3/dbe/tutorial_opening_closing_hats.html',1,'More Morphology Transformations'],['https://docs.opencv.org/4.2.0/d9/d61/tutorial_py_morphological_ops.html',1,'Morphological Transformations'],['https://docs.opencv.org/4.2.0/d4/d76/tutorial_js_morphological_ops.html',1,'Morphological Transformations'],['https://docs.opencv.org/4.2.0/d7/d72/tutorial_transformations.html',1,'Transformations']]], - ['transformations_20of_20images_87',['Transformations of Images',['https://docs.opencv.org/4.2.0/da/d6e/tutorial_py_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dd/d52/tutorial_js_geometric_transformations.html',1,'Geometric Transformations of Images']]], - ['transforms_20in_20opencv_88',['Image Transforms in OpenCV',['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'']]], - ['transforms_20in_20opencv_20js_89',['Image Transforms in OpenCV.js',['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'']]], - ['transition_20guide_90',['Transition guide',['https://docs.opencv.org/4.2.0/db/dfa/tutorial_transition_guide.html',1,'']]], - ['tutorial_91',['tutorial',['https://docs.opencv.org/4.2.0/db/d56/tutorial_capture_graycode_pattern.html',1,'Capture Gray code pattern tutorial'],['https://docs.opencv.org/4.2.0/d0/de8/tutorial_capture_sinusoidal_pattern.html',1,'Capture Sinusoidal pattern tutorial'],['https://docs.opencv.org/4.2.0/dc/da9/tutorial_decode_graycode_pattern.html',1,'Decode Gray code pattern tutorial']]], - ['tutorial_92',['Line Features Tutorial',['https://docs.opencv.org/4.2.0/df/dfa/tutorial_line_descriptor_main.html',1,'']]], - ['tutorial_93',['Phase Unwrapping tutorial',['https://docs.opencv.org/4.2.0/db/d74/tutorial_unwrap_phase_map.html',1,'']]], - ['tutorial_20on_20facial_20landmark_20detector_20api_94',['Tutorial on Facial Landmark Detector API',['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'']]], - ['tutorials_95',['Fuzzy image processing tutorials',['https://docs.opencv.org/4.2.0/d7/d36/tutorial_fuzzy.html',1,'']]], - ['tutorials_96',['Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'Introduction to OpenCV-Python Tutorials'],['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'Introduction to OpenCV.js and Tutorials'],['https://docs.opencv.org/4.2.0/d9/df8/tutorial_root.html',1,'OpenCV Tutorials'],['https://docs.opencv.org/4.2.0/d6/d00/tutorial_py_root.html',1,'OpenCV-Python Tutorials'],['https://docs.opencv.org/4.2.0/d5/d10/tutorial_js_root.html',1,'OpenCV.js Tutorials']]], - ['tutorials_97',['Structured Light tutorials',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_structured_light.html',1,'']]], - ['tutorials_20for_20bgsegm_20module_98',['Tutorials for bgsegm module',['https://docs.opencv.org/4.2.0/d3/d89/tutorial_table_of_content_bgsegm.html',1,'']]], - ['tutorials_20for_20contrib_20modules_99',['Tutorials for contrib modules',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_contrib_root.html',1,'']]], - ['tutorials_20for_20face_20module_100',['Tutorials for face module',['https://docs.opencv.org/4.2.0/de/d27/tutorial_table_of_content_face.html',1,'']]], - ['tutorialsparse_5fexample_5fdetails_101',['TutorialSparse_example_details',['https://eigen.tuxfamily.org/dox/TutorialSparse_example_details.html',1,'']]], - ['two_20dimensional_20phase_20maps_102',['Unwrap two-dimensional phase maps',['https://docs.opencv.org/4.2.0/d9/dfb/tutorial_unwrap.html',1,'']]], - ['two_20images_20using_20opencv_103',['Adding (blending) two images using OpenCV',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_adding_images.html',1,'']]], - ['type_104',['Adding a new expression type',['https://eigen.tuxfamily.org/dox/TopicNewExpressionType.html',1,'']]], - ['typename_20keywords_20in_20c_105',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], - ['types_106',['types',['https://eigen.tuxfamily.org/dox/TopicScalarTypes.html',1,'Scalar types'],['https://eigen.tuxfamily.org/dox/TopicCustomizing_CustomScalar.html',1,'Using custom scalar types']]], - ['types_20as_20parameters_107',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]] + ['to_20parallelize_20your_20code_51',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], + ['to_20principal_20component_20analysis_20pca_52',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], + ['to_20run_20deep_20networks_20in_20browser_53',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], + ['to_20run_20deep_20networks_20on_20android_20device_54',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], + ['to_20scan_20images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_55',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], + ['to_20schedule_20your_20network_20for_20halide_20backend_56',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], + ['to_20sift_20scale_20invariant_20feature_20transform_57',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], + ['to_20support_20vector_20machines_58',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], + ['to_20surf_20speeded_20up_20robust_20features_59',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], + ['to_20the_20facemark_20api_60',['Adding a new algorithm to the Facemark API',['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'']]], + ['to_20track_61',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], + ['to_20use_20background_20subtraction_20methods_62',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], + ['to_20use_20the_20opencv_20parallel_5ffor_5f_20to_20parallelize_20your_20code_63',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], + ['to_20your_20application_64',['Add a Trackbar to Your Application',['https://docs.opencv.org/4.2.0/d5/df3/tutorial_js_trackbar.html',1,'']]], + ['to_20your_20images_65',['Adding borders to your images',['https://docs.opencv.org/4.2.0/dc/da3/tutorial_copyMakeBorder.html',1,'']]], + ['tomasi_20corner_20detector_66',['Shi-Tomasi corner detector',['https://docs.opencv.org/4.2.0/d8/dd8/tutorial_good_features_to_track.html',1,'']]], + ['tomasi_20corner_20detector_20good_20features_20to_20track_67',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], + ['topics_68',['General topics',['https://eigen.tuxfamily.org/dox/UserManual_Generalities.html',1,'']]], + ['track_69',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], + ['trackbar_20as_20the_20color_20palette_70',['Trackbar as the Color Palette',['https://docs.opencv.org/4.2.0/d9/dc8/tutorial_py_trackbar.html',1,'']]], + ['trackbar_20to_20our_20applications_71',['Adding a Trackbar to our applications!',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'']]], + ['trackbar_20to_20your_20application_72',['Add a Trackbar to Your Application',['https://docs.opencv.org/4.2.0/d5/df3/tutorial_js_trackbar.html',1,'']]], + ['tracker_73',['Tracker',['https://docs.opencv.org/4.2.0/dc/db8/tutorial_customizing_cn_tracker.html',1,'Customizing the CN Tracker'],['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'Introduction to OpenCV Tracker']]], + ['tracking_74',['AKAZE and ORB planar tracking',['https://docs.opencv.org/4.2.0/dc/d16/tutorial_akaze_tracking.html',1,'']]], + ['training_75',['Cascade Classifier Training',['https://docs.opencv.org/4.2.0/dc/d88/tutorial_traincascade.html',1,'']]], + ['training_76',['Structured forest training',['https://docs.opencv.org/4.2.0/d2/d59/tutorial_ximgproc_training.html',1,'']]], + ['training_20data_20generation_20using_20icosphere_77',['Training data generation using Icosphere',['https://docs.opencv.org/4.2.0/d6/df4/tutorial_data_generation.html',1,'']]], + ['training_20model_20analysis_78',['Training Model Analysis',['https://docs.opencv.org/4.2.0/d8/d09/tutorial_model_analysis.html',1,'']]], + ['training_20the_20learning_20based_20white_20balance_20algorithm_79',['Training the learning-based white balance algorithm',['https://docs.opencv.org/4.2.0/dc/dcb/tutorial_xphoto_training_white_balance.html',1,'']]], + ['transform_80',['Transform',['https://docs.opencv.org/4.2.0/d8/d01/tutorial_discrete_fourier_transform.html',1,'Discrete Fourier Transform'],['https://docs.opencv.org/4.2.0/de/dbc/tutorial_py_fourier_transform.html',1,'Fourier Transform'],['https://docs.opencv.org/4.2.0/dd/d02/tutorial_js_fourier_transform.html',1,'Fourier Transform'],['https://docs.opencv.org/4.2.0/d4/d70/tutorial_hough_circle.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/da/d53/tutorial_py_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d3/de5/tutorial_js_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d9/db0/tutorial_hough_lines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d6/d10/tutorial_py_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d3/de6/tutorial_js_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'Introduction to SIFT (Scale-Invariant Feature Transform)']]], + ['transform_81',['transform',['https://docs.opencv.org/4.2.0/d3/d1d/tutorial_fuzzy_filtering.html',1,'Filtering using F-transform'],['https://docs.opencv.org/4.2.0/d3/db8/tutorial_fuzzy_inpainting.html',1,'Inpainting using F-transform']]], + ['transform_20and_20watershed_20algorithm_82',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], + ['transform_20theory_83',['F-transform theory',['https://docs.opencv.org/4.2.0/db/daf/tutorial_fuzzy_theory.html',1,'']]], + ['transformations_84',['Transformations',['https://docs.opencv.org/4.2.0/d4/d61/tutorial_warp_affine.html',1,'Affine Transformations'],['https://docs.opencv.org/4.2.0/d3/dbe/tutorial_opening_closing_hats.html',1,'More Morphology Transformations'],['https://docs.opencv.org/4.2.0/d9/d61/tutorial_py_morphological_ops.html',1,'Morphological Transformations'],['https://docs.opencv.org/4.2.0/d4/d76/tutorial_js_morphological_ops.html',1,'Morphological Transformations'],['https://docs.opencv.org/4.2.0/d7/d72/tutorial_transformations.html',1,'Transformations']]], + ['transformations_20of_20images_85',['Transformations of Images',['https://docs.opencv.org/4.2.0/da/d6e/tutorial_py_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dd/d52/tutorial_js_geometric_transformations.html',1,'Geometric Transformations of Images']]], + ['transforms_20in_20opencv_86',['Image Transforms in OpenCV',['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'']]], + ['transforms_20in_20opencv_20js_87',['Image Transforms in OpenCV.js',['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'']]], + ['transition_20guide_88',['Transition guide',['https://docs.opencv.org/4.2.0/db/dfa/tutorial_transition_guide.html',1,'']]], + ['tutorial_89',['Line Features Tutorial',['https://docs.opencv.org/4.2.0/df/dfa/tutorial_line_descriptor_main.html',1,'']]], + ['tutorial_90',['tutorial',['https://docs.opencv.org/4.2.0/db/d56/tutorial_capture_graycode_pattern.html',1,'Capture Gray code pattern tutorial'],['https://docs.opencv.org/4.2.0/d0/de8/tutorial_capture_sinusoidal_pattern.html',1,'Capture Sinusoidal pattern tutorial'],['https://docs.opencv.org/4.2.0/dc/da9/tutorial_decode_graycode_pattern.html',1,'Decode Gray code pattern tutorial'],['https://docs.opencv.org/4.2.0/db/d74/tutorial_unwrap_phase_map.html',1,'Phase Unwrapping tutorial']]], + ['tutorial_20on_20facial_20landmark_20detector_20api_91',['Tutorial on Facial Landmark Detector API',['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'']]], + ['tutorials_92',['Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'Introduction to OpenCV-Python Tutorials'],['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'Introduction to OpenCV.js and Tutorials'],['https://docs.opencv.org/4.2.0/d9/df8/tutorial_root.html',1,'OpenCV Tutorials'],['https://docs.opencv.org/4.2.0/d6/d00/tutorial_py_root.html',1,'OpenCV-Python Tutorials'],['https://docs.opencv.org/4.2.0/d5/d10/tutorial_js_root.html',1,'OpenCV.js Tutorials']]], + ['tutorials_93',['tutorials',['https://docs.opencv.org/4.2.0/d7/d36/tutorial_fuzzy.html',1,'Fuzzy image processing tutorials'],['https://docs.opencv.org/4.2.0/d3/d81/tutorial_structured_light.html',1,'Structured Light tutorials']]], + ['tutorials_20for_20bgsegm_20module_94',['Tutorials for bgsegm module',['https://docs.opencv.org/4.2.0/d3/d89/tutorial_table_of_content_bgsegm.html',1,'']]], + ['tutorials_20for_20contrib_20modules_95',['Tutorials for contrib modules',['https://docs.opencv.org/4.2.0/d3/d81/tutorial_contrib_root.html',1,'']]], + ['tutorials_20for_20face_20module_96',['Tutorials for face module',['https://docs.opencv.org/4.2.0/de/d27/tutorial_table_of_content_face.html',1,'']]], + ['tutorialsparse_5fexample_5fdetails_97',['TutorialSparse_example_details',['https://eigen.tuxfamily.org/dox/TutorialSparse_example_details.html',1,'']]], + ['two_20dimensional_20phase_20maps_98',['Unwrap two-dimensional phase maps',['https://docs.opencv.org/4.2.0/d9/dfb/tutorial_unwrap.html',1,'']]], + ['two_20images_20using_20opencv_99',['Adding (blending) two images using OpenCV',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_adding_images.html',1,'']]], + ['type_100',['Adding a new expression type',['https://eigen.tuxfamily.org/dox/TopicNewExpressionType.html',1,'']]], + ['typename_20keywords_20in_20c_101',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], + ['types_102',['types',['https://eigen.tuxfamily.org/dox/TopicScalarTypes.html',1,'Scalar types'],['https://eigen.tuxfamily.org/dox/TopicCustomizing_CustomScalar.html',1,'Using custom scalar types']]], + ['types_20as_20parameters_103',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]] ]; diff --git a/search/pages_1b.js b/search/pages_1b.js index 268640dc..0169fe9f 100644 --- a/search/pages_1b.js +++ b/search/pages_1b.js @@ -5,26 +5,27 @@ var searchData= ['vector_20machines_20svm_2',['Support Vector Machines (SVM)',['https://docs.opencv.org/4.2.0/d3/d02/tutorial_py_svm_index.html',1,'']]], ['vectorization_3',['Vectorization',['https://eigen.tuxfamily.org/dox/TopicVectorization.html',1,'']]], ['version_202_2014_201_20and_20cmake_20version_203_209_201_4',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], - ['vertical_20lines_20by_20using_20morphological_20operations_5',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], - ['via_20nullary_20expressions_6',['Matrix manipulation via nullary-expressions',['https://eigen.tuxfamily.org/dox/TopicCustomizing_NullaryExpr.html',1,'']]], - ['video_7',['video',['https://docs.opencv.org/4.2.0/d8/d3c/tutorial_face_landmark_detection_in_video.html',1,'Face landmark detection in a video'],['https://docs.opencv.org/4.2.0/de/d7f/tutorial_dnn_superres_upscale_video.html',1,'Upscaling video']]], - ['video_20analysis_8',['Video Analysis',['https://docs.opencv.org/4.2.0/d3/db0/tutorial_py_table_of_contents_video.html',1,'Video Analysis'],['https://docs.opencv.org/4.2.0/de/db6/tutorial_js_table_of_contents_video.html',1,'Video Analysis']]], - ['video_20analysis_20video_20module_9',['Video analysis (video module)',['https://docs.opencv.org/4.2.0/da/dd0/tutorial_table_of_content_video.html',1,'']]], - ['video_20capture_10',['Video Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'Face Detection in Video Capture'],['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'Image Processing for Video Capture']]], - ['video_20i_20o_20with_20opencv_20overview_11',['Video I/O with OpenCV Overview',['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'']]], - ['video_20input_20and_20output_20videoio_20module_12',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], - ['video_20input_20with_20opencv_20and_20similarity_20measurement_13',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], - ['video_20module_14',['Video analysis (video module)',['https://docs.opencv.org/4.2.0/da/dd0/tutorial_table_of_content_video.html',1,'']]], - ['video_20processing_15',['OpenCV iOS - Video Processing',['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'']]], - ['video_20with_20opencv_16',['Creating a video with OpenCV',['https://docs.opencv.org/4.2.0/d7/d9e/tutorial_video_write.html',1,'']]], - ['videoio_20module_17',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], - ['videos_18',['Videos',['https://docs.opencv.org/4.2.0/dd/d43/tutorial_py_video_display.html',1,'Getting Started with Videos'],['https://docs.opencv.org/4.2.0/dd/d00/tutorial_js_video_display.html',1,'Getting Started with Videos']]], - ['viewing_20in_20memory_20images_20in_20the_20visual_20studio_20debugger_19',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['vision_20',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], - ['vision_20applications_21',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], - ['vision_20cuda_20module_22',['GPU-Accelerated Computer Vision (cuda module)',['https://docs.opencv.org/4.2.0/da/d2c/tutorial_table_of_content_gpu.html',1,'']]], - ['visual_20debugging_20of_20computer_20vision_20applications_23',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], - ['visual_20studio_24',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['visual_20studio_20debugger_25',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['viz_26',['Viz',['https://docs.opencv.org/4.2.0/d5/d7d/tutorial_launching_viz.html',1,'Launching Viz'],['https://docs.opencv.org/4.2.0/d7/df9/tutorial_table_of_content_viz.html',1,'OpenCV Viz']]] + ['version_203_209_201_5',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['vertical_20lines_20by_20using_20morphological_20operations_6',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], + ['via_20nullary_20expressions_7',['Matrix manipulation via nullary-expressions',['https://eigen.tuxfamily.org/dox/TopicCustomizing_NullaryExpr.html',1,'']]], + ['video_8',['video',['https://docs.opencv.org/4.2.0/d8/d3c/tutorial_face_landmark_detection_in_video.html',1,'Face landmark detection in a video'],['https://docs.opencv.org/4.2.0/de/d7f/tutorial_dnn_superres_upscale_video.html',1,'Upscaling video']]], + ['video_20analysis_9',['Video Analysis',['https://docs.opencv.org/4.2.0/d3/db0/tutorial_py_table_of_contents_video.html',1,'Video Analysis'],['https://docs.opencv.org/4.2.0/de/db6/tutorial_js_table_of_contents_video.html',1,'Video Analysis']]], + ['video_20analysis_20video_20module_10',['Video analysis (video module)',['https://docs.opencv.org/4.2.0/da/dd0/tutorial_table_of_content_video.html',1,'']]], + ['video_20capture_11',['Video Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'Face Detection in Video Capture'],['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'Image Processing for Video Capture']]], + ['video_20i_20o_20with_20opencv_20overview_12',['Video I/O with OpenCV Overview',['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'']]], + ['video_20input_20and_20output_20videoio_20module_13',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], + ['video_20input_20with_20opencv_20and_20similarity_20measurement_14',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], + ['video_20module_15',['Video analysis (video module)',['https://docs.opencv.org/4.2.0/da/dd0/tutorial_table_of_content_video.html',1,'']]], + ['video_20processing_16',['OpenCV iOS - Video Processing',['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'']]], + ['video_20with_20opencv_17',['Creating a video with OpenCV',['https://docs.opencv.org/4.2.0/d7/d9e/tutorial_video_write.html',1,'']]], + ['videoio_20module_18',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], + ['videos_19',['Videos',['https://docs.opencv.org/4.2.0/dd/d43/tutorial_py_video_display.html',1,'Getting Started with Videos'],['https://docs.opencv.org/4.2.0/dd/d00/tutorial_js_video_display.html',1,'Getting Started with Videos']]], + ['viewing_20in_20memory_20images_20in_20the_20visual_20studio_20debugger_20',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['vision_21',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], + ['vision_20applications_22',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], + ['vision_20cuda_20module_23',['GPU-Accelerated Computer Vision (cuda module)',['https://docs.opencv.org/4.2.0/da/d2c/tutorial_table_of_content_gpu.html',1,'']]], + ['visual_20debugging_20of_20computer_20vision_20applications_24',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], + ['visual_20studio_25',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['visual_20studio_20debugger_26',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['viz_27',['Viz',['https://docs.opencv.org/4.2.0/d5/d7d/tutorial_launching_viz.html',1,'Launching Viz'],['https://docs.opencv.org/4.2.0/d7/df9/tutorial_table_of_content_viz.html',1,'OpenCV Viz']]] ]; diff --git a/search/pages_1c.js b/search/pages_1c.js index 6ead574c..8ddd705c 100644 --- a/search/pages_1c.js +++ b/search/pages_1c.js @@ -21,23 +21,22 @@ var searchData= ['with_20gdal_18',['Reading Geospatial Raster files with GDAL',['https://docs.opencv.org/4.2.0/d7/d73/tutorial_raster_io_gdal.html',1,'']]], ['with_20images_19',['with Images',['https://docs.opencv.org/4.2.0/dc/d2e/tutorial_py_image_display.html',1,'Getting Started with Images'],['https://docs.opencv.org/4.2.0/df/d24/tutorial_js_image_display.html',1,'Getting Started with Images']]], ['with_20images_20',['Operations with images',['https://docs.opencv.org/4.2.0/d5/d98/tutorial_mat_operations.html',1,'']]], - ['with_20opencv_21',['Android Development with OpenCV',['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'']]], - ['with_20opencv_22',['Camera calibration With OpenCV',['https://docs.opencv.org/4.2.0/d4/d94/tutorial_camera_calibration.html',1,'']]], - ['with_20opencv_23',['with OpenCV',['https://docs.opencv.org/4.2.0/d7/d9e/tutorial_video_write.html',1,'Creating a video with OpenCV'],['https://docs.opencv.org/4.2.0/da/d60/tutorial_face_main.html',1,'Face Recognition with OpenCV'],['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'How to scan images, lookup tables and time measurement with OpenCV'],['https://docs.opencv.org/4.2.0/df/d61/tutorial_random_generator_and_text.html',1,'Random generator and text with OpenCV']]], - ['with_20opencv_20and_20similarity_20measurement_24',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], - ['with_20opencv_20inside_20the_20microsoft_20visual_20studio_25',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['with_20opencv_20overview_26',['Video I/O with OpenCV Overview',['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'']]], - ['with_20square_20chessboard_27',['Camera calibration with square chessboard',['https://docs.opencv.org/4.2.0/dc/d43/tutorial_camera_calibration_square_chess.html',1,'']]], - ['with_20thrust_28',['Using a cv::cuda::GpuMat with thrust',['https://docs.opencv.org/4.2.0/d8/db9/tutorial_gpu_thrust_interop.html',1,'']]], - ['with_20videos_29',['with Videos',['https://docs.opencv.org/4.2.0/dd/d43/tutorial_py_video_display.html',1,'Getting Started with Videos'],['https://docs.opencv.org/4.2.0/dd/d00/tutorial_js_video_display.html',1,'Getting Started with Videos']]], - ['with_20watershed_20algorithm_30',['with Watershed Algorithm',['https://docs.opencv.org/4.2.0/d3/db4/tutorial_py_watershed.html',1,'Image Segmentation with Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d7/d1c/tutorial_js_watershed.html',1,'Image Segmentation with Watershed Algorithm']]], - ['works_31',['How OpenCV-Python Bindings Works?',['https://docs.opencv.org/4.2.0/da/d49/tutorial_py_bindings_basics.html',1,'']]], - ['world_20vision_32',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], - ['writing_20and_20reading_20datasets_33',['Creating, Writing and Reading Datasets',['https://docs.opencv.org/4.2.0/d4/d93/tutorial_hdf_create_read_write_datasets.html',1,'']]], - ['writing_20attributes_34',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]], - ['writing_20documentation_20for_20opencv_35',['Writing documentation for OpenCV',['https://docs.opencv.org/4.2.0/d4/db1/tutorial_documentation.html',1,'']]], - ['writing_20efficient_20matrix_20product_20expressions_36',['Writing efficient matrix product expressions',['https://eigen.tuxfamily.org/dox/TopicWritingEfficientProductExpression.html',1,'']]], - ['writing_20functions_20taking_20eigen_20types_20as_20parameters_37',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], - ['written_20data_20using_20knn_38',['OCR of Hand-written Data using kNN',['https://docs.opencv.org/4.2.0/d8/d4b/tutorial_py_knn_opencv.html',1,'']]], - ['written_20data_20using_20svm_39',['OCR of Hand-written Data using SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'']]] + ['with_20opencv_21',['Camera calibration With OpenCV',['https://docs.opencv.org/4.2.0/d4/d94/tutorial_camera_calibration.html',1,'']]], + ['with_20opencv_22',['with OpenCV',['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'Android Development with OpenCV'],['https://docs.opencv.org/4.2.0/d7/d9e/tutorial_video_write.html',1,'Creating a video with OpenCV'],['https://docs.opencv.org/4.2.0/da/d60/tutorial_face_main.html',1,'Face Recognition with OpenCV'],['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'How to scan images, lookup tables and time measurement with OpenCV'],['https://docs.opencv.org/4.2.0/df/d61/tutorial_random_generator_and_text.html',1,'Random generator and text with OpenCV']]], + ['with_20opencv_20and_20similarity_20measurement_23',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], + ['with_20opencv_20inside_20the_20microsoft_20visual_20studio_24',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['with_20opencv_20overview_25',['Video I/O with OpenCV Overview',['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'']]], + ['with_20square_20chessboard_26',['Camera calibration with square chessboard',['https://docs.opencv.org/4.2.0/dc/d43/tutorial_camera_calibration_square_chess.html',1,'']]], + ['with_20thrust_27',['Using a cv::cuda::GpuMat with thrust',['https://docs.opencv.org/4.2.0/d8/db9/tutorial_gpu_thrust_interop.html',1,'']]], + ['with_20videos_28',['with Videos',['https://docs.opencv.org/4.2.0/dd/d43/tutorial_py_video_display.html',1,'Getting Started with Videos'],['https://docs.opencv.org/4.2.0/dd/d00/tutorial_js_video_display.html',1,'Getting Started with Videos']]], + ['with_20watershed_20algorithm_29',['with Watershed Algorithm',['https://docs.opencv.org/4.2.0/d3/db4/tutorial_py_watershed.html',1,'Image Segmentation with Watershed Algorithm'],['https://docs.opencv.org/4.2.0/d7/d1c/tutorial_js_watershed.html',1,'Image Segmentation with Watershed Algorithm']]], + ['works_30',['How OpenCV-Python Bindings Works?',['https://docs.opencv.org/4.2.0/da/d49/tutorial_py_bindings_basics.html',1,'']]], + ['world_20vision_31',['Retina and real-world vision',['https://docs.opencv.org/4.2.0/d3/d86/tutorial_bioinspired_retina_model.html',1,'']]], + ['writing_20and_20reading_20datasets_32',['Creating, Writing and Reading Datasets',['https://docs.opencv.org/4.2.0/d4/d93/tutorial_hdf_create_read_write_datasets.html',1,'']]], + ['writing_20attributes_33',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]], + ['writing_20documentation_20for_20opencv_34',['Writing documentation for OpenCV',['https://docs.opencv.org/4.2.0/d4/db1/tutorial_documentation.html',1,'']]], + ['writing_20efficient_20matrix_20product_20expressions_35',['Writing efficient matrix product expressions',['https://eigen.tuxfamily.org/dox/TopicWritingEfficientProductExpression.html',1,'']]], + ['writing_20functions_20taking_20eigen_20types_20as_20parameters_36',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], + ['written_20data_20using_20knn_37',['OCR of Hand-written Data using kNN',['https://docs.opencv.org/4.2.0/d8/d4b/tutorial_py_knn_opencv.html',1,'']]], + ['written_20data_20using_20svm_38',['OCR of Hand-written Data using SVM',['https://docs.opencv.org/4.2.0/dd/d3b/tutorial_py_svm_opencv.html',1,'']]] ]; diff --git a/search/pages_6.js b/search/pages_6.js index 53f15ddb..fd0fdc52 100644 --- a/search/pages_6.js +++ b/search/pages_6.js @@ -32,8 +32,8 @@ var searchData= ['algorithm_20to_20the_20facemark_20api_29',['Adding a new algorithm to the Facemark API',['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'']]], ['algorithm_20with_20g_20api_30',['Implementing a face beautification algorithm with G-API',['https://docs.opencv.org/4.2.0/d4/d48/tutorial_gapi_face_beautification.html',1,'']]], ['aliasing_31',['Lazy Evaluation and Aliasing',['https://eigen.tuxfamily.org/dox/TopicLazyEvaluation.html',1,'']]], - ['an_20image_32',['an image',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'Changing the contrast and brightness of an image!'],['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'Face landmark detection in an image']]], - ['an_20image_33',['an Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'Load and Display an Image'],['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'Load, Modify, and Save an Image']]], + ['an_20image_32',['an Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'Load and Display an Image'],['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'Load, Modify, and Save an Image']]], + ['an_20image_33',['an image',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'Changing the contrast and brightness of an image!'],['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'Face landmark detection in an image']]], ['analysis_34',['Analysis',['https://docs.opencv.org/4.2.0/d8/d09/tutorial_model_analysis.html',1,'Training Model Analysis'],['https://docs.opencv.org/4.2.0/d3/db0/tutorial_py_table_of_contents_video.html',1,'Video Analysis'],['https://docs.opencv.org/4.2.0/de/db6/tutorial_js_table_of_contents_video.html',1,'Video Analysis']]], ['analysis_20pca_35',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], ['analysis_20video_20module_36',['Video analysis (video module)',['https://docs.opencv.org/4.2.0/da/dd0/tutorial_table_of_content_video.html',1,'']]], @@ -77,32 +77,33 @@ var searchData= ['and_20vertical_20lines_20by_20using_20morphological_20operations_74',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], ['and_20watershed_20algorithm_75',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], ['and_20writing_20attributes_76',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]], - ['android_20camera_20preview_20based_20cv_20application_77',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], - ['android_20development_78',['Introduction into Android Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'']]], - ['android_20development_20with_20opencv_79',['Android Development with OpenCV',['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'']]], - ['android_20device_80',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], - ['anisotropic_20image_20segmentation_20by_20a_20gradient_20structure_20tensor_81',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], - ['anisotropic_20image_20segmentation_20on_20g_20api_82',['Porting anisotropic image segmentation on G-API',['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'']]], - ['api_83',['API',['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'Adding a new algorithm to the Facemark API'],['https://docs.opencv.org/4.2.0/d8/d24/tutorial_gapi_interactive_face_detection.html',1,'Face analytics pipeline with G-API'],['https://docs.opencv.org/4.2.0/d0/d1e/gapi.html',1,'Graph API'],['https://docs.opencv.org/4.2.0/d4/d48/tutorial_gapi_face_beautification.html',1,'Implementing a face beautification algorithm with G-API'],['https://docs.opencv.org/4.2.0/d0/d25/gapi_kernel_api.html',1,'Kernel API'],['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'Porting anisotropic image segmentation on G-API'],['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'Tutorial on Facial Landmark Detector API'],['https://docs.opencv.org/4.2.0/d7/dec/tutorial_facemark_usage.html',1,'Using the Facemark API'],['https://docs.opencv.org/4.2.0/d6/dc9/gapi_purposes.html',1,'Why Graph API?']]], - ['api_20gapi_20module_84',['Graph API (gapi module)',['https://docs.opencv.org/4.2.0/df/d7e/tutorial_table_of_content_gapi.html',1,'']]], - ['api_20overview_85',['G-API Overview',['https://docs.opencv.org/4.2.0/db/d87/md_gapi_doc_slides_README.html',1,'']]], - ['api_20stitcher_20class_86',['High level stitching API (Stitcher class)',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'']]], - ['application_87',['Add a Trackbar to Your Application',['https://docs.opencv.org/4.2.0/d5/df3/tutorial_js_trackbar.html',1,'']]], - ['application_88',['application',['https://docs.opencv.org/4.2.0/d7/d21/tutorial_interactive_calibration.html',1,'Interactive camera calibration application'],['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'Use OpenCL in Android camera preview based CV application']]], - ['applications_89',['applications',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'Adding a Trackbar to our applications!'],['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'Interactive Visual Debugging of Computer Vision applications']]], - ['applications_20with_20opencv_20inside_20the_20microsoft_20visual_20studio_90',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['arithmetic_20operations_20on_20images_91',['Arithmetic Operations on Images',['https://docs.opencv.org/4.2.0/d0/d86/tutorial_py_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_image_arithmetics.html',1,'Arithmetic Operations on Images']]], - ['arm_20based_20linux_20systems_92',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]], - ['aruco_20and_20charuco_93',['Calibration with ArUco and ChArUco',['https://docs.opencv.org/4.2.0/da/d13/tutorial_aruco_calibration.html',1,'']]], - ['aruco_20boards_94',['Detection of ArUco Boards',['https://docs.opencv.org/4.2.0/db/da9/tutorial_aruco_board_detection.html',1,'']]], - ['aruco_20marker_20detection_20aruco_20module_95',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], - ['aruco_20markers_96',['Detection of ArUco Markers',['https://docs.opencv.org/4.2.0/d5/dae/tutorial_aruco_detection.html',1,'']]], - ['aruco_20module_97',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], - ['aruco_20module_20faq_98',['Aruco module FAQ',['https://docs.opencv.org/4.2.0/d1/dcb/tutorial_aruco_faq.html',1,'']]], - ['as_20a_20paint_20brush_99',['Mouse as a Paint-Brush',['https://docs.opencv.org/4.2.0/db/d5b/tutorial_py_mouse_handling.html',1,'']]], - ['as_20parameters_100',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], - ['as_20the_20color_20palette_101',['Trackbar as the Color Palette',['https://docs.opencv.org/4.2.0/d9/dc8/tutorial_py_trackbar.html',1,'']]], - ['asked_20questions_102',['Frequently Asked Questions',['https://docs.opencv.org/4.2.0/d3/d2d/faq.html',1,'']]], - ['assertions_103',['Assertions',['https://eigen.tuxfamily.org/dox/TopicAssertions.html',1,'']]], - ['attributes_104',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]] + ['and_20yaml_20files_77',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], + ['android_20camera_20preview_20based_20cv_20application_78',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], + ['android_20development_79',['Introduction into Android Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'']]], + ['android_20development_20with_20opencv_80',['Android Development with OpenCV',['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'']]], + ['android_20device_81',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], + ['anisotropic_20image_20segmentation_20by_20a_20gradient_20structure_20tensor_82',['Anisotropic image segmentation by a gradient structure tensor',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_anisotropic_image_segmentation_by_a_gst.html',1,'']]], + ['anisotropic_20image_20segmentation_20on_20g_20api_83',['Porting anisotropic image segmentation on G-API',['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'']]], + ['api_84',['API',['https://docs.opencv.org/4.2.0/d4/d3e/tutorial_facemark_add_algorithm.html',1,'Adding a new algorithm to the Facemark API'],['https://docs.opencv.org/4.2.0/d8/d24/tutorial_gapi_interactive_face_detection.html',1,'Face analytics pipeline with G-API'],['https://docs.opencv.org/4.2.0/d0/d1e/gapi.html',1,'Graph API'],['https://docs.opencv.org/4.2.0/d4/d48/tutorial_gapi_face_beautification.html',1,'Implementing a face beautification algorithm with G-API'],['https://docs.opencv.org/4.2.0/d0/d25/gapi_kernel_api.html',1,'Kernel API'],['https://docs.opencv.org/4.2.0/d3/d7a/tutorial_gapi_anisotropic_segmentation.html',1,'Porting anisotropic image segmentation on G-API'],['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'Tutorial on Facial Landmark Detector API'],['https://docs.opencv.org/4.2.0/d7/dec/tutorial_facemark_usage.html',1,'Using the Facemark API'],['https://docs.opencv.org/4.2.0/d6/dc9/gapi_purposes.html',1,'Why Graph API?']]], + ['api_20gapi_20module_85',['Graph API (gapi module)',['https://docs.opencv.org/4.2.0/df/d7e/tutorial_table_of_content_gapi.html',1,'']]], + ['api_20overview_86',['G-API Overview',['https://docs.opencv.org/4.2.0/db/d87/md_gapi_doc_slides_README.html',1,'']]], + ['api_20stitcher_20class_87',['High level stitching API (Stitcher class)',['https://docs.opencv.org/4.2.0/d8/d19/tutorial_stitcher.html',1,'']]], + ['application_88',['Add a Trackbar to Your Application',['https://docs.opencv.org/4.2.0/d5/df3/tutorial_js_trackbar.html',1,'']]], + ['application_89',['application',['https://docs.opencv.org/4.2.0/d7/d21/tutorial_interactive_calibration.html',1,'Interactive camera calibration application'],['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'Use OpenCL in Android camera preview based CV application']]], + ['applications_90',['applications',['https://docs.opencv.org/4.2.0/da/d6a/tutorial_trackbar.html',1,'Adding a Trackbar to our applications!'],['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'Interactive Visual Debugging of Computer Vision applications']]], + ['applications_20with_20opencv_20inside_20the_20microsoft_20visual_20studio_91',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['arithmetic_20operations_20on_20images_92',['Arithmetic Operations on Images',['https://docs.opencv.org/4.2.0/d0/d86/tutorial_py_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_image_arithmetics.html',1,'Arithmetic Operations on Images']]], + ['arm_20based_20linux_20systems_93',['Cross compilation for ARM based Linux systems',['https://docs.opencv.org/4.2.0/d0/d76/tutorial_arm_crosscompile_with_cmake.html',1,'']]], + ['aruco_20and_20charuco_94',['Calibration with ArUco and ChArUco',['https://docs.opencv.org/4.2.0/da/d13/tutorial_aruco_calibration.html',1,'']]], + ['aruco_20boards_95',['Detection of ArUco Boards',['https://docs.opencv.org/4.2.0/db/da9/tutorial_aruco_board_detection.html',1,'']]], + ['aruco_20marker_20detection_20aruco_20module_96',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], + ['aruco_20markers_97',['Detection of ArUco Markers',['https://docs.opencv.org/4.2.0/d5/dae/tutorial_aruco_detection.html',1,'']]], + ['aruco_20module_98',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], + ['aruco_20module_20faq_99',['Aruco module FAQ',['https://docs.opencv.org/4.2.0/d1/dcb/tutorial_aruco_faq.html',1,'']]], + ['as_20a_20paint_20brush_100',['Mouse as a Paint-Brush',['https://docs.opencv.org/4.2.0/db/d5b/tutorial_py_mouse_handling.html',1,'']]], + ['as_20parameters_101',['Writing Functions Taking Eigen Types as Parameters',['https://eigen.tuxfamily.org/dox/TopicFunctionTakingEigenTypes.html',1,'']]], + ['as_20the_20color_20palette_102',['Trackbar as the Color Palette',['https://docs.opencv.org/4.2.0/d9/dc8/tutorial_py_trackbar.html',1,'']]], + ['asked_20questions_103',['Frequently Asked Questions',['https://docs.opencv.org/4.2.0/d3/d2d/faq.html',1,'']]], + ['assertions_104',['Assertions',['https://eigen.tuxfamily.org/dox/TopicAssertions.html',1,'']]], + ['attributes_105',['Reading and Writing Attributes',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_hdf_read_write_attributes.html',1,'']]] ]; diff --git a/search/pages_9.js b/search/pages_9.js index f1401930..a7ca7a2e 100644 --- a/search/pages_9.js +++ b/search/pages_9.js @@ -25,46 +25,44 @@ var searchData= ['design_20overview_22',['High-level design overview',['https://docs.opencv.org/4.2.0/de/d4d/gapi_hld.html',1,'']]], ['details_23',['Implementation details',['https://docs.opencv.org/4.2.0/d4/ddd/gapi_impl.html',1,'']]], ['detecting_20corners_20location_20in_20subpixels_24',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], - ['detection_25',['Detection',['https://docs.opencv.org/4.2.0/da/d22/tutorial_py_canny.html',1,'Canny Edge Detection'],['https://docs.opencv.org/4.2.0/d7/de1/tutorial_js_canny.html',1,'Canny Edge Detection']]], - ['detection_26',['Face swapping using face landmark detection',['https://docs.opencv.org/4.2.0/d1/d52/tutorial_face_swapping_face_landmark_detection.html',1,'']]], - ['detection_27',['Detection',['https://docs.opencv.org/4.2.0/df/d0c/tutorial_py_fast.html',1,'FAST Algorithm for Corner Detection'],['https://docs.opencv.org/4.2.0/d7/d66/tutorial_feature_detection.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/dc/d0d/tutorial_py_features_harris.html',1,'Harris Corner Detection'],['https://docs.opencv.org/4.2.0/d9/de5/tutorial_py_table_of_contents_objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/dc/d73/tutorial_js_table_of_contents_objdetect.html',1,'Object Detection']]], - ['detection_28',['Structured forests for fast edge detection',['https://docs.opencv.org/4.2.0/d0/da5/tutorial_ximgproc_prediction.html',1,'']]], - ['detection_20and_20description_29',['Feature Detection and Description',['https://docs.opencv.org/4.2.0/db/d27/tutorial_py_table_of_contents_feature2d.html',1,'']]], - ['detection_20aruco_20module_30',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], - ['detection_20in_20a_20video_31',['Face landmark detection in a video',['https://docs.opencv.org/4.2.0/d8/d3c/tutorial_face_landmark_detection_in_video.html',1,'']]], - ['detection_20in_20an_20image_32',['Face landmark detection in an image',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'']]], - ['detection_20in_20video_20capture_33',['Face Detection in Video Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'']]], - ['detection_20objdetect_20module_34',['Object Detection (objdetect module)',['https://docs.opencv.org/4.2.0/d2/d64/tutorial_table_of_content_objdetect.html',1,'']]], - ['detection_20of_20aruco_20boards_35',['Detection of ArUco Boards',['https://docs.opencv.org/4.2.0/db/da9/tutorial_aruco_board_detection.html',1,'']]], - ['detection_20of_20aruco_20markers_36',['Detection of ArUco Markers',['https://docs.opencv.org/4.2.0/d5/dae/tutorial_aruco_detection.html',1,'']]], - ['detection_20of_20charuco_20corners_37',['Detection of ChArUco Corners',['https://docs.opencv.org/4.2.0/df/d4a/tutorial_charuco_detection.html',1,'']]], - ['detection_20of_20diamond_20markers_38',['Detection of Diamond Markers',['https://docs.opencv.org/4.2.0/d5/d07/tutorial_charuco_diamond_detection.html',1,'']]], - ['detection_20of_20planar_20objects_39',['Detection of planar objects',['https://docs.opencv.org/4.2.0/dd/dd4/tutorial_detection_of_planar_objects.html',1,'']]], - ['detection_20using_20cnns_40',['Object Detection using CNNs',['https://docs.opencv.org/4.2.0/d2/da2/tutorial_dnn_objdetect.html',1,'']]], - ['detection_20using_20haar_20cascades_41',['Detection using Haar Cascades',['https://docs.opencv.org/4.2.0/d7/d8b/tutorial_py_face_detection.html',1,'Face Detection using Haar Cascades'],['https://docs.opencv.org/4.2.0/d2/d99/tutorial_js_face_detection.html',1,'Face Detection using Haar Cascades']]], - ['detector_42',['Canny Edge Detector',['https://docs.opencv.org/4.2.0/da/d5c/tutorial_canny_detector.html',1,'']]], - ['detector_43',['detector',['https://docs.opencv.org/4.2.0/d9/dbc/tutorial_generic_corner_detector.html',1,'Creating your own corner detector'],['https://docs.opencv.org/4.2.0/d4/d7d/tutorial_harris_detector.html',1,'Harris corner detector'],['https://docs.opencv.org/4.2.0/d8/dd8/tutorial_good_features_to_track.html',1,'Shi-Tomasi corner detector']]], - ['detector_20api_44',['Tutorial on Facial Landmark Detector API',['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'']]], - ['detector_20good_20features_20to_20track_45',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], - ['development_46',['Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'Introduction into Android Development'],['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'Introduction to Java Development']]], - ['development_20with_20clojure_47',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], - ['development_20with_20opencv_48',['Android Development with OpenCV',['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'']]], - ['device_49',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], - ['diamond_20markers_50',['Detection of Diamond Markers',['https://docs.opencv.org/4.2.0/d5/d07/tutorial_charuco_diamond_detection.html',1,'']]], - ['dilating_51',['Eroding and Dilating',['https://docs.opencv.org/4.2.0/db/df6/tutorial_erosion_dilatation.html',1,'']]], - ['dimensional_20phase_20maps_52',['Unwrap two-dimensional phase maps',['https://docs.opencv.org/4.2.0/d9/dfb/tutorial_unwrap.html',1,'']]], - ['directives_53',['Preprocessor directives',['https://eigen.tuxfamily.org/dox/TopicPreprocessorDirectives.html',1,'']]], - ['discovering_20the_20human_20retina_20and_20its_20use_20for_20image_20processing_54',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], - ['discrete_20fourier_20transform_55',['Discrete Fourier Transform',['https://docs.opencv.org/4.2.0/d8/d01/tutorial_discrete_fourier_transform.html',1,'']]], - ['disparity_20map_20post_20filtering_56',['Disparity map post-filtering',['https://docs.opencv.org/4.2.0/d3/d14/tutorial_ximgproc_disparity_filtering.html',1,'']]], - ['display_20an_20image_57',['Load and Display an Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'']]], - ['distance_20transform_20and_20watershed_20algorithm_58',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], - ['dnn_20module_59',['Deep Neural Networks (dnn module)',['https://docs.opencv.org/4.2.0/d2/d58/tutorial_table_of_content_dnn.html',1,'']]], - ['dnns_60',['YOLO DNNs',['https://docs.opencv.org/4.2.0/da/d9d/tutorial_dnn_yolo.html',1,'']]], - ['documentation_20for_20opencv_61',['Writing documentation for OpenCV',['https://docs.opencv.org/4.2.0/d4/db1/tutorial_documentation.html',1,'']]], - ['doxygen_20projects_62',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], - ['drawing_63',['Basic Drawing',['https://docs.opencv.org/4.2.0/d3/d96/tutorial_basic_geometric_drawing.html',1,'']]], - ['drawing_20functions_20in_20opencv_64',['Drawing Functions in OpenCV',['https://docs.opencv.org/4.2.0/dc/da5/tutorial_py_drawing_functions.html',1,'']]], - ['dynamic_20range_20hdr_65',['High Dynamic Range (HDR)',['https://docs.opencv.org/4.2.0/d2/df0/tutorial_py_hdr.html',1,'']]], - ['dynamic_20range_20imaging_66',['High Dynamic Range Imaging',['https://docs.opencv.org/4.2.0/d3/db7/tutorial_hdr_imaging.html',1,'']]] + ['detection_25',['Detection',['https://docs.opencv.org/4.2.0/da/d22/tutorial_py_canny.html',1,'Canny Edge Detection'],['https://docs.opencv.org/4.2.0/d7/de1/tutorial_js_canny.html',1,'Canny Edge Detection'],['https://docs.opencv.org/4.2.0/df/d0c/tutorial_py_fast.html',1,'FAST Algorithm for Corner Detection'],['https://docs.opencv.org/4.2.0/d7/d66/tutorial_feature_detection.html',1,'Feature Detection'],['https://docs.opencv.org/4.2.0/dc/d0d/tutorial_py_features_harris.html',1,'Harris Corner Detection'],['https://docs.opencv.org/4.2.0/d9/de5/tutorial_py_table_of_contents_objdetect.html',1,'Object Detection'],['https://docs.opencv.org/4.2.0/dc/d73/tutorial_js_table_of_contents_objdetect.html',1,'Object Detection']]], + ['detection_26',['detection',['https://docs.opencv.org/4.2.0/d1/d52/tutorial_face_swapping_face_landmark_detection.html',1,'Face swapping using face landmark detection'],['https://docs.opencv.org/4.2.0/d0/da5/tutorial_ximgproc_prediction.html',1,'Structured forests for fast edge detection']]], + ['detection_20and_20description_27',['Feature Detection and Description',['https://docs.opencv.org/4.2.0/db/d27/tutorial_py_table_of_contents_feature2d.html',1,'']]], + ['detection_20aruco_20module_28',['ArUco marker detection (aruco module)',['https://docs.opencv.org/4.2.0/d9/d6d/tutorial_table_of_content_aruco.html',1,'']]], + ['detection_20in_20a_20video_29',['Face landmark detection in a video',['https://docs.opencv.org/4.2.0/d8/d3c/tutorial_face_landmark_detection_in_video.html',1,'']]], + ['detection_20in_20an_20image_30',['Face landmark detection in an image',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'']]], + ['detection_20in_20video_20capture_31',['Face Detection in Video Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'']]], + ['detection_20objdetect_20module_32',['Object Detection (objdetect module)',['https://docs.opencv.org/4.2.0/d2/d64/tutorial_table_of_content_objdetect.html',1,'']]], + ['detection_20of_20aruco_20boards_33',['Detection of ArUco Boards',['https://docs.opencv.org/4.2.0/db/da9/tutorial_aruco_board_detection.html',1,'']]], + ['detection_20of_20aruco_20markers_34',['Detection of ArUco Markers',['https://docs.opencv.org/4.2.0/d5/dae/tutorial_aruco_detection.html',1,'']]], + ['detection_20of_20charuco_20corners_35',['Detection of ChArUco Corners',['https://docs.opencv.org/4.2.0/df/d4a/tutorial_charuco_detection.html',1,'']]], + ['detection_20of_20diamond_20markers_36',['Detection of Diamond Markers',['https://docs.opencv.org/4.2.0/d5/d07/tutorial_charuco_diamond_detection.html',1,'']]], + ['detection_20of_20planar_20objects_37',['Detection of planar objects',['https://docs.opencv.org/4.2.0/dd/dd4/tutorial_detection_of_planar_objects.html',1,'']]], + ['detection_20using_20cnns_38',['Object Detection using CNNs',['https://docs.opencv.org/4.2.0/d2/da2/tutorial_dnn_objdetect.html',1,'']]], + ['detection_20using_20haar_20cascades_39',['Detection using Haar Cascades',['https://docs.opencv.org/4.2.0/d7/d8b/tutorial_py_face_detection.html',1,'Face Detection using Haar Cascades'],['https://docs.opencv.org/4.2.0/d2/d99/tutorial_js_face_detection.html',1,'Face Detection using Haar Cascades']]], + ['detector_40',['Canny Edge Detector',['https://docs.opencv.org/4.2.0/da/d5c/tutorial_canny_detector.html',1,'']]], + ['detector_41',['detector',['https://docs.opencv.org/4.2.0/d9/dbc/tutorial_generic_corner_detector.html',1,'Creating your own corner detector'],['https://docs.opencv.org/4.2.0/d4/d7d/tutorial_harris_detector.html',1,'Harris corner detector'],['https://docs.opencv.org/4.2.0/d8/dd8/tutorial_good_features_to_track.html',1,'Shi-Tomasi corner detector']]], + ['detector_20api_42',['Tutorial on Facial Landmark Detector API',['https://docs.opencv.org/4.2.0/d5/d47/tutorial_table_of_content_facemark.html',1,'']]], + ['detector_20good_20features_20to_20track_43',['Shi-Tomasi Corner Detector & Good Features to Track',['https://docs.opencv.org/4.2.0/d4/d8c/tutorial_py_shi_tomasi.html',1,'']]], + ['development_44',['Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'Introduction into Android Development'],['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'Introduction to Java Development']]], + ['development_20with_20clojure_45',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], + ['development_20with_20opencv_46',['Android Development with OpenCV',['https://docs.opencv.org/4.2.0/d5/df8/tutorial_dev_with_OCV_on_Android.html',1,'']]], + ['device_47',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], + ['diamond_20markers_48',['Detection of Diamond Markers',['https://docs.opencv.org/4.2.0/d5/d07/tutorial_charuco_diamond_detection.html',1,'']]], + ['dilating_49',['Eroding and Dilating',['https://docs.opencv.org/4.2.0/db/df6/tutorial_erosion_dilatation.html',1,'']]], + ['dimensional_20phase_20maps_50',['Unwrap two-dimensional phase maps',['https://docs.opencv.org/4.2.0/d9/dfb/tutorial_unwrap.html',1,'']]], + ['directives_51',['Preprocessor directives',['https://eigen.tuxfamily.org/dox/TopicPreprocessorDirectives.html',1,'']]], + ['discovering_20the_20human_20retina_20and_20its_20use_20for_20image_20processing_52',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], + ['discrete_20fourier_20transform_53',['Discrete Fourier Transform',['https://docs.opencv.org/4.2.0/d8/d01/tutorial_discrete_fourier_transform.html',1,'']]], + ['disparity_20map_20post_20filtering_54',['Disparity map post-filtering',['https://docs.opencv.org/4.2.0/d3/d14/tutorial_ximgproc_disparity_filtering.html',1,'']]], + ['display_20an_20image_55',['Load and Display an Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'']]], + ['distance_20transform_20and_20watershed_20algorithm_56',['Image Segmentation with Distance Transform and Watershed Algorithm',['https://docs.opencv.org/4.2.0/d2/dbd/tutorial_distance_transform.html',1,'']]], + ['dnn_20module_57',['Deep Neural Networks (dnn module)',['https://docs.opencv.org/4.2.0/d2/d58/tutorial_table_of_content_dnn.html',1,'']]], + ['dnns_58',['YOLO DNNs',['https://docs.opencv.org/4.2.0/da/d9d/tutorial_dnn_yolo.html',1,'']]], + ['documentation_20for_20opencv_59',['Writing documentation for OpenCV',['https://docs.opencv.org/4.2.0/d4/db1/tutorial_documentation.html',1,'']]], + ['doxygen_20projects_60',['Cross referencing OpenCV from other Doxygen projects',['https://docs.opencv.org/4.2.0/d3/dff/tutorial_cross_referencing.html',1,'']]], + ['drawing_61',['Basic Drawing',['https://docs.opencv.org/4.2.0/d3/d96/tutorial_basic_geometric_drawing.html',1,'']]], + ['drawing_20functions_20in_20opencv_62',['Drawing Functions in OpenCV',['https://docs.opencv.org/4.2.0/dc/da5/tutorial_py_drawing_functions.html',1,'']]], + ['dynamic_20range_20hdr_63',['High Dynamic Range (HDR)',['https://docs.opencv.org/4.2.0/d2/df0/tutorial_py_hdr.html',1,'']]], + ['dynamic_20range_20imaging_64',['High Dynamic Range Imaging',['https://docs.opencv.org/4.2.0/d3/db7/tutorial_hdr_imaging.html',1,'']]] ]; diff --git a/search/pages_d.js b/search/pages_d.js index 383ade11..c7f6d73a 100644 --- a/search/pages_d.js +++ b/search/pages_d.js @@ -23,30 +23,32 @@ var searchData= ['histogram_20',['Creating a 3D histogram',['https://docs.opencv.org/4.2.0/d1/d1d/tutorial_histo3D.html',1,'']]], ['histogram_203_20_3a_20histogram_20backprojection_21',['Histogram - 3 : Histogram Backprojection',['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_histogram_backprojection.html',1,'']]], ['histogram_204_20_3a_20histogram_20backprojection_22',['Histogram - 4 : Histogram Backprojection',['https://docs.opencv.org/4.2.0/dc/df6/tutorial_py_histogram_backprojection.html',1,'']]], - ['histogram_20calculation_23',['Histogram Calculation',['https://docs.opencv.org/4.2.0/d8/dbc/tutorial_histogram_calculation.html',1,'']]], - ['histogram_20comparison_24',['Histogram Comparison',['https://docs.opencv.org/4.2.0/d8/dc8/tutorial_histogram_comparison.html',1,'']]], - ['histogram_20equalization_25',['Histogram Equalization',['https://docs.opencv.org/4.2.0/d4/d1b/tutorial_histogram_equalization.html',1,'Histogram Equalization'],['https://docs.opencv.org/4.2.0/d5/daf/tutorial_py_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization'],['https://docs.opencv.org/4.2.0/d2/d74/tutorial_js_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization']]], - ['histograms_201_20_3a_20find_20plot_20analyze_26',['Histograms 1 : Find Plot Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], - ['histograms_202_3a_20histogram_20equalization_27',['Histograms 2: Histogram Equalization',['https://docs.opencv.org/4.2.0/d5/daf/tutorial_py_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization'],['https://docs.opencv.org/4.2.0/d2/d74/tutorial_js_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization']]], - ['histograms_203_20_3a_202d_20histograms_28',['Histograms - 3 : 2D Histograms',['https://docs.opencv.org/4.2.0/dd/d0d/tutorial_py_2d_histogram.html',1,'']]], - ['histograms_20in_20opencv_29',['Histograms in OpenCV',['https://docs.opencv.org/4.2.0/de/db2/tutorial_py_table_of_contents_histograms.html',1,'']]], - ['histograms_20in_20opencv_20js_30',['Histograms in OpenCV.js',['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'']]], - ['hit_20or_20miss_31',['Hit-or-Miss',['https://docs.opencv.org/4.2.0/db/d06/tutorial_hitOrMiss.html',1,'']]], - ['homography_20explained_20with_20code_32',['Basic concepts of the homography explained with code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'']]], - ['homography_20to_20find_20a_20known_20object_33',['Features2D + Homography to find a known object',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_feature_homography.html',1,'']]], - ['homography_20to_20find_20objects_34',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], - ['horizontal_20and_20vertical_20lines_20by_20using_20morphological_20operations_35',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], - ['hough_20circle_20transform_36',['Hough Circle Transform',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_hough_circle.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/da/d53/tutorial_py_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d3/de5/tutorial_js_houghcircles.html',1,'Hough Circle Transform']]], - ['hough_20line_20transform_37',['Hough Line Transform',['https://docs.opencv.org/4.2.0/d9/db0/tutorial_hough_lines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d6/d10/tutorial_py_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d3/de6/tutorial_js_houghlines.html',1,'Hough Line Transform']]], - ['how_20opencv_20python_20bindings_20works_38',['How OpenCV-Python Bindings Works?',['https://docs.opencv.org/4.2.0/da/d49/tutorial_py_bindings_basics.html',1,'']]], - ['how_20to_20build_20applications_20with_20opencv_20inside_20the_20microsoft_20visual_20studio_39',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['how_20to_20enable_20halide_20backend_20for_20improve_20efficiency_40',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], - ['how_20to_20run_20deep_20networks_20in_20browser_41',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], - ['how_20to_20run_20deep_20networks_20on_20android_20device_42',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], - ['how_20to_20scan_20images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_43',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], - ['how_20to_20schedule_20your_20network_20for_20halide_20backend_44',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], - ['how_20to_20use_20background_20subtraction_20methods_45',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], - ['how_20to_20use_20the_20opencv_20parallel_5ffor_5f_20to_20parallelize_20your_20code_46',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], - ['hull_47',['Convex Hull',['https://docs.opencv.org/4.2.0/d7/d1d/tutorial_hull.html',1,'']]], - ['human_20retina_20and_20its_20use_20for_20image_20processing_48',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]] + ['histogram_20backprojection_23',['Histogram Backprojection',['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_histogram_backprojection.html',1,'Histogram - 3 : Histogram Backprojection'],['https://docs.opencv.org/4.2.0/dc/df6/tutorial_py_histogram_backprojection.html',1,'Histogram - 4 : Histogram Backprojection']]], + ['histogram_20calculation_24',['Histogram Calculation',['https://docs.opencv.org/4.2.0/d8/dbc/tutorial_histogram_calculation.html',1,'']]], + ['histogram_20comparison_25',['Histogram Comparison',['https://docs.opencv.org/4.2.0/d8/dc8/tutorial_histogram_comparison.html',1,'']]], + ['histogram_20equalization_26',['Histogram Equalization',['https://docs.opencv.org/4.2.0/d4/d1b/tutorial_histogram_equalization.html',1,'Histogram Equalization'],['https://docs.opencv.org/4.2.0/d5/daf/tutorial_py_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization'],['https://docs.opencv.org/4.2.0/d2/d74/tutorial_js_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization']]], + ['histograms_27',['Histograms - 3 : 2D Histograms',['https://docs.opencv.org/4.2.0/dd/d0d/tutorial_py_2d_histogram.html',1,'']]], + ['histograms_201_20_3a_20find_20plot_20analyze_28',['Histograms 1 : Find Plot Analyze',['https://docs.opencv.org/4.2.0/d1/db7/tutorial_py_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!'],['https://docs.opencv.org/4.2.0/d7/d32/tutorial_js_histogram_begins.html',1,'Histograms - 1 : Find, Plot, Analyze !!!']]], + ['histograms_202_3a_20histogram_20equalization_29',['Histograms 2: Histogram Equalization',['https://docs.opencv.org/4.2.0/d5/daf/tutorial_py_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization'],['https://docs.opencv.org/4.2.0/d2/d74/tutorial_js_histogram_equalization.html',1,'Histograms - 2: Histogram Equalization']]], + ['histograms_203_20_3a_202d_20histograms_30',['Histograms - 3 : 2D Histograms',['https://docs.opencv.org/4.2.0/dd/d0d/tutorial_py_2d_histogram.html',1,'']]], + ['histograms_20in_20opencv_31',['Histograms in OpenCV',['https://docs.opencv.org/4.2.0/de/db2/tutorial_py_table_of_contents_histograms.html',1,'']]], + ['histograms_20in_20opencv_20js_32',['Histograms in OpenCV.js',['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'']]], + ['hit_20or_20miss_33',['Hit-or-Miss',['https://docs.opencv.org/4.2.0/db/d06/tutorial_hitOrMiss.html',1,'']]], + ['homography_20explained_20with_20code_34',['Basic concepts of the homography explained with code',['https://docs.opencv.org/4.2.0/d9/dab/tutorial_homography.html',1,'']]], + ['homography_20to_20find_20a_20known_20object_35',['Features2D + Homography to find a known object',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_feature_homography.html',1,'']]], + ['homography_20to_20find_20objects_36',['Feature Matching + Homography to find Objects',['https://docs.opencv.org/4.2.0/d1/de0/tutorial_py_feature_homography.html',1,'']]], + ['horizontal_20and_20vertical_20lines_20by_20using_20morphological_20operations_37',['Extract horizontal and vertical lines by using morphological operations',['https://docs.opencv.org/4.2.0/dd/dd7/tutorial_morph_lines_detection.html',1,'']]], + ['hough_20circle_20transform_38',['Hough Circle Transform',['https://docs.opencv.org/4.2.0/d4/d70/tutorial_hough_circle.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/da/d53/tutorial_py_houghcircles.html',1,'Hough Circle Transform'],['https://docs.opencv.org/4.2.0/d3/de5/tutorial_js_houghcircles.html',1,'Hough Circle Transform']]], + ['hough_20line_20transform_39',['Hough Line Transform',['https://docs.opencv.org/4.2.0/d9/db0/tutorial_hough_lines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d6/d10/tutorial_py_houghlines.html',1,'Hough Line Transform'],['https://docs.opencv.org/4.2.0/d3/de6/tutorial_js_houghlines.html',1,'Hough Line Transform']]], + ['how_20opencv_20python_20bindings_20works_40',['How OpenCV-Python Bindings Works?',['https://docs.opencv.org/4.2.0/da/d49/tutorial_py_bindings_basics.html',1,'']]], + ['how_20to_20build_20applications_20with_20opencv_20inside_20the_20microsoft_20visual_20studio_41',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['how_20to_20enable_20halide_20backend_20for_20improve_20efficiency_42',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], + ['how_20to_20run_20deep_20networks_20in_20browser_43',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], + ['how_20to_20run_20deep_20networks_20on_20android_20device_44',['How to run deep networks on Android device',['https://docs.opencv.org/4.2.0/d0/d6c/tutorial_dnn_android.html',1,'']]], + ['how_20to_20scan_20images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_45',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], + ['how_20to_20schedule_20your_20network_20for_20halide_20backend_46',['How to schedule your network for Halide backend',['https://docs.opencv.org/4.2.0/de/d5d/tutorial_dnn_halide_scheduling.html',1,'']]], + ['how_20to_20use_20background_20subtraction_20methods_47',['How to Use Background Subtraction Methods',['https://docs.opencv.org/4.2.0/d1/dc5/tutorial_background_subtraction.html',1,'']]], + ['how_20to_20use_20the_20opencv_20parallel_5ffor_5f_20to_20parallelize_20your_20code_48',['How to use the OpenCV parallel_for_ to parallelize your code',['https://docs.opencv.org/4.2.0/d7/dff/tutorial_how_to_use_OpenCV_parallel_for_.html',1,'']]], + ['hull_49',['Convex Hull',['https://docs.opencv.org/4.2.0/d7/d1d/tutorial_hull.html',1,'']]], + ['human_20retina_20and_20its_20use_20for_20image_20processing_50',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]] ]; diff --git a/search/pages_e.js b/search/pages_e.js index c49602b8..24635f71 100644 --- a/search/pages_e.js +++ b/search/pages_e.js @@ -4,16 +4,16 @@ var searchData= ['i_20o_20with_20opencv_20overview_1',['Video I/O with OpenCV Overview',['https://docs.opencv.org/4.2.0/d0/da7/videoio_overview.html',1,'']]], ['icosphere_2',['Training data generation using Icosphere',['https://docs.opencv.org/4.2.0/d6/df4/tutorial_data_generation.html',1,'']]], ['illusions_3',['Processing images causing optical illusions',['https://docs.opencv.org/4.2.0/d7/d8f/tutorial_bioinspired_retina_illusion.html',1,'']]], - ['image_4',['image',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'Changing the contrast and brightness of an image!'],['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'Face landmark detection in an image'],['https://docs.opencv.org/4.2.0/df/d0d/tutorial_find_contours.html',1,'Finding contours in your image']]], - ['image_5',['Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'Load and Display an Image'],['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'Load, Modify, and Save an Image']]], + ['image_4',['Image',['https://docs.opencv.org/4.2.0/db/deb/tutorial_display_image.html',1,'Load and Display an Image'],['https://docs.opencv.org/4.2.0/db/d64/tutorial_load_save_image.html',1,'Load, Modify, and Save an Image']]], + ['image_5',['image',['https://docs.opencv.org/4.2.0/d3/dc1/tutorial_basic_linear_transform.html',1,'Changing the contrast and brightness of an image!'],['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'Face landmark detection in an image'],['https://docs.opencv.org/4.2.0/df/d0d/tutorial_find_contours.html',1,'Finding contours in your image']]], ['image_20container_6',['Mat - The Basic Image Container',['https://docs.opencv.org/4.2.0/d6/d6d/tutorial_mat_the_basic_image_container.html',1,'']]], ['image_20denoising_7',['Image Denoising',['https://docs.opencv.org/4.2.0/d5/d69/tutorial_py_non_local_means.html',1,'']]], ['image_20gradients_8',['Image Gradients',['https://docs.opencv.org/4.2.0/d5/d0f/tutorial_py_gradients.html',1,'Image Gradients'],['https://docs.opencv.org/4.2.0/da/d85/tutorial_js_gradients.html',1,'Image Gradients']]], ['image_20inpainting_9',['Image Inpainting',['https://docs.opencv.org/4.2.0/df/d3d/tutorial_py_inpainting.html',1,'Image Inpainting'],['https://docs.opencv.org/4.2.0/dc/d2f/tutorial_xphoto_inpainting.html',1,'Image Inpainting']]], ['image_20input_20and_20output_20imgcodecs_20module_10',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], ['image_20moments_11',['Image Moments',['https://docs.opencv.org/4.2.0/d0/d49/tutorial_moments.html',1,'']]], - ['image_20processing_12',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], - ['image_20processing_13',['Image Processing',['https://docs.opencv.org/4.2.0/d2/df0/tutorial_js_table_of_contents_imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'OpenCV iOS - Image Processing']]], + ['image_20processing_12',['Image Processing',['https://docs.opencv.org/4.2.0/d2/df0/tutorial_js_table_of_contents_imgproc.html',1,'Image Processing'],['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'OpenCV iOS - Image Processing']]], + ['image_20processing_13',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]], ['image_20processing_20for_20video_20capture_14',['Image Processing for Video Capture',['https://docs.opencv.org/4.2.0/d8/d54/tutorial_js_imgproc_camera.html',1,'']]], ['image_20processing_20imgproc_20module_15',['Image Processing (imgproc module)',['https://docs.opencv.org/4.2.0/d7/da8/tutorial_table_of_content_imgproc.html',1,'']]], ['image_20processing_20in_20opencv_16',['Image Processing in OpenCV',['https://docs.opencv.org/4.2.0/d2/d96/tutorial_py_table_of_contents_imgproc.html',1,'']]], @@ -27,89 +27,88 @@ var searchData= ['image_20transforms_20in_20opencv_24',['Image Transforms in OpenCV',['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'']]], ['image_20transforms_20in_20opencv_20js_25',['Image Transforms in OpenCV.js',['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'']]], ['image_20watch_3a_20viewing_20in_20memory_20images_20in_20the_20visual_20studio_20debugger_26',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['images_27',['Adding borders to your images',['https://docs.opencv.org/4.2.0/dc/da3/tutorial_copyMakeBorder.html',1,'']]], - ['images_28',['Images',['https://docs.opencv.org/4.2.0/d0/d86/tutorial_py_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/d3/df2/tutorial_py_basic_ops.html',1,'Basic Operations on Images'],['https://docs.opencv.org/4.2.0/de/d06/tutorial_js_basic_ops.html',1,'Basic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d53/tutorial_py_depthmap.html',1,'Depth Map from Stereo Images'],['https://docs.opencv.org/4.2.0/da/d6e/tutorial_py_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dd/d52/tutorial_js_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dc/d2e/tutorial_py_image_display.html',1,'Getting Started with Images'],['https://docs.opencv.org/4.2.0/df/d24/tutorial_js_image_display.html',1,'Getting Started with Images']]], - ['images_29',['Operations with images',['https://docs.opencv.org/4.2.0/d5/d98/tutorial_mat_operations.html',1,'']]], - ['images_30',['Images',['https://docs.opencv.org/4.2.0/dc/dd3/tutorial_gausian_median_blur_bilateral_filter.html',1,'Smoothing Images'],['https://docs.opencv.org/4.2.0/d4/d13/tutorial_py_filtering.html',1,'Smoothing Images'],['https://docs.opencv.org/4.2.0/dd/d6a/tutorial_js_filtering.html',1,'Smoothing Images']]], - ['images_20causing_20optical_20illusions_31',['Processing images causing optical illusions',['https://docs.opencv.org/4.2.0/d7/d8f/tutorial_bioinspired_retina_illusion.html',1,'']]], - ['images_20in_20the_20visual_20studio_20debugger_32',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_33',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], - ['images_20stitching_20stitching_20module_34',['Images stitching (stitching module)',['https://docs.opencv.org/4.2.0/d0/d33/tutorial_table_of_content_stitching.html',1,'']]], - ['images_20using_20opencv_35',['Adding (blending) two images using OpenCV',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_adding_images.html',1,'']]], - ['images_3a_20multi_20output_36',['Upscaling images: multi-output',['https://docs.opencv.org/4.2.0/d6/dca/tutorial_dnn_superres_upscale_image_multi.html',1,'']]], - ['images_3a_20single_20output_37',['Upscaling images: single-output',['https://docs.opencv.org/4.2.0/d5/d29/tutorial_dnn_superres_upscale_image_single.html',1,'']]], - ['imaging_38',['High Dynamic Range Imaging',['https://docs.opencv.org/4.2.0/d3/db7/tutorial_hdr_imaging.html',1,'']]], - ['imgcodecs_20module_39',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], - ['imgproc_20module_40',['Image Processing (imgproc module)',['https://docs.opencv.org/4.2.0/d7/da8/tutorial_table_of_content_imgproc.html',1,'']]], - ['implementation_20details_41',['Implementation details',['https://docs.opencv.org/4.2.0/d4/ddd/gapi_impl.html',1,'']]], - ['implementing_20a_20face_20beautification_20algorithm_20with_20g_20api_42',['Implementing a face beautification algorithm with G-API',['https://docs.opencv.org/4.2.0/d4/d48/tutorial_gapi_face_beautification.html',1,'']]], - ['import_20reconstruction_43',['Import Reconstruction',['https://docs.opencv.org/4.2.0/de/dfd/tutorial_sfm_import_reconstruction.html',1,'']]], - ['improve_20efficiency_44',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], - ['improvement_20techniques_45',['Performance Measurement and Improvement Techniques',['https://docs.opencv.org/4.2.0/dc/d71/tutorial_py_optimization.html',1,'']]], - ['in_20a_20video_46',['Face landmark detection in a video',['https://docs.opencv.org/4.2.0/d8/d3c/tutorial_face_landmark_detection_in_video.html',1,'']]], - ['in_20an_20image_47',['Face landmark detection in an image',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'']]], - ['in_20android_20camera_20preview_20based_20cv_20application_48',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], - ['in_20browser_49',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], - ['in_20c_50',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], - ['in_20cmake_20projects_51',['Using Eigen in CMake Projects',['https://eigen.tuxfamily.org/dox/TopicCMakeGuide.html',1,'']]], - ['in_20cuda_20kernels_52',['Using Eigen in CUDA kernels',['https://eigen.tuxfamily.org/dox/TopicCUDA.html',1,'']]], - ['in_20eigen_53',['Expression templates in Eigen',['https://eigen.tuxfamily.org/dox/TopicEigenExpressionTemplates.html',1,'']]], - ['in_20fedora_54',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], - ['in_20ios_55',['Installation in iOS',['https://docs.opencv.org/4.2.0/d5/da3/tutorial_ios_install.html',1,'']]], - ['in_20linux_56',['Installation in Linux',['https://docs.opencv.org/4.2.0/d7/d9f/tutorial_linux_install.html',1,'']]], - ['in_20macos_57',['Installation in MacOS',['https://docs.opencv.org/4.2.0/d0/db2/tutorial_macos_install.html',1,'']]], - ['in_20memory_20images_20in_20the_20visual_20studio_20debugger_58',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], - ['in_20node_20js_59',['Using OpenCV.js In Node.js',['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'']]], - ['in_20opencv_60',['in OpenCV',['https://docs.opencv.org/4.2.0/d3/d05/tutorial_py_table_of_contents_contours.html',1,'Contours in OpenCV'],['https://docs.opencv.org/4.2.0/dc/da5/tutorial_py_drawing_functions.html',1,'Drawing Functions in OpenCV'],['https://docs.opencv.org/4.2.0/dc/d4d/tutorial_py_table_of_contents_gui.html',1,'Gui Features in OpenCV'],['https://docs.opencv.org/4.2.0/de/db2/tutorial_py_table_of_contents_histograms.html',1,'Histograms in OpenCV'],['https://docs.opencv.org/4.2.0/d2/d96/tutorial_py_table_of_contents_imgproc.html',1,'Image Processing in OpenCV'],['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'Image Transforms in OpenCV'],['https://docs.opencv.org/4.2.0/d1/d5c/tutorial_py_kmeans_opencv.html',1,'K-Means Clustering in OpenCV']]], - ['in_20opencv_20js_61',['in OpenCV js',['https://docs.opencv.org/4.2.0/d0/d43/tutorial_js_table_of_contents_contours.html',1,'Contours in OpenCV.js'],['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'Histograms in OpenCV.js'],['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'Image Transforms in OpenCV.js']]], - ['in_20subpixels_62',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], - ['in_20ubuntu_63',['Install OpenCV-Python in Ubuntu',['https://docs.opencv.org/4.2.0/d2/de6/tutorial_py_setup_in_ubuntu.html',1,'']]], - ['in_20video_20capture_64',['Face Detection in Video Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'']]], - ['in_20windows_65',['in Windows',['https://docs.opencv.org/4.2.0/d5/de5/tutorial_py_setup_in_windows.html',1,'Install OpenCV-Python in Windows'],['https://docs.opencv.org/4.2.0/d3/d52/tutorial_windows_install.html',1,'Installation in Windows']]], - ['in_20your_20image_66',['Finding contours in your image',['https://docs.opencv.org/4.2.0/df/d0d/tutorial_find_contours.html',1,'']]], - ['independent_20elementary_20features_67',['BRIEF (Binary Robust Independent Elementary Features)',['https://docs.opencv.org/4.2.0/dc/d7d/tutorial_py_brief.html',1,'']]], - ['inheriting_20from_20matrix_68',['Inheriting from Matrix',['https://eigen.tuxfamily.org/dox/TopicCustomizing_InheritingMatrix.html',1,'']]], - ['inpainting_69',['Inpainting',['https://docs.opencv.org/4.2.0/df/d3d/tutorial_py_inpainting.html',1,'Image Inpainting'],['https://docs.opencv.org/4.2.0/dc/d2f/tutorial_xphoto_inpainting.html',1,'Image Inpainting']]], - ['inpainting_20using_20f_20transform_70',['Inpainting using F-transform',['https://docs.opencv.org/4.2.0/d3/db8/tutorial_fuzzy_inpainting.html',1,'']]], - ['input_20and_20output_20imgcodecs_20module_71',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], - ['input_20and_20output_20using_20xml_20and_20yaml_20files_72',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], - ['input_20and_20output_20videoio_20module_73',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], - ['input_20with_20opencv_20and_20similarity_20measurement_74',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], - ['inrange_75',['Thresholding Operations using inRange',['https://docs.opencv.org/4.2.0/da/d97/tutorial_threshold_inRange.html',1,'']]], - ['inside_20eigen_20on_20a_20simple_20example_76',['What happens inside Eigen, on a simple example',['https://eigen.tuxfamily.org/dox/TopicInsideEigenExample.html',1,'']]], - ['inside_20the_20microsoft_20visual_20studio_77',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], - ['install_20opencv_20python_20in_20fedora_78',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], - ['install_20opencv_20python_20in_20ubuntu_79',['Install OpenCV-Python in Ubuntu',['https://docs.opencv.org/4.2.0/d2/de6/tutorial_py_setup_in_ubuntu.html',1,'']]], - ['install_20opencv_20python_20in_20windows_80',['Install OpenCV-Python in Windows',['https://docs.opencv.org/4.2.0/d5/de5/tutorial_py_setup_in_windows.html',1,'']]], - ['installation_81',['SFM module installation',['https://docs.opencv.org/4.2.0/db/db8/tutorial_sfm_installation.html',1,'']]], - ['installation_20by_20using_20git_20bash_20version_202_2014_201_20and_20cmake_20version_203_209_201_82',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], - ['installation_20in_20ios_83',['Installation in iOS',['https://docs.opencv.org/4.2.0/d5/da3/tutorial_ios_install.html',1,'']]], - ['installation_20in_20linux_84',['Installation in Linux',['https://docs.opencv.org/4.2.0/d7/d9f/tutorial_linux_install.html',1,'']]], - ['installation_20in_20macos_85',['Installation in MacOS',['https://docs.opencv.org/4.2.0/d0/db2/tutorial_macos_install.html',1,'']]], - ['installation_20in_20windows_86',['Installation in Windows',['https://docs.opencv.org/4.2.0/d3/d52/tutorial_windows_install.html',1,'']]], - ['intel®_20mkl_20from_20eigen_87',['Using Intel® MKL from Eigen',['https://eigen.tuxfamily.org/dox/TopicUsingIntelMKL.html',1,'']]], - ['intel_20perceptual_20computing_20sdk_20compatible_20depth_20sensors_88',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], - ['interactive_20camera_20calibration_20application_89',['Interactive camera calibration application',['https://docs.opencv.org/4.2.0/d7/d21/tutorial_interactive_calibration.html',1,'']]], - ['interactive_20foreground_20extraction_20using_20grabcut_20algorithm_90',['Interactive Foreground Extraction using GrabCut Algorithm',['https://docs.opencv.org/4.2.0/d8/d83/tutorial_py_grabcut.html',1,'']]], - ['interactive_20visual_20debugging_20of_20computer_20vision_20applications_91',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], - ['into_20android_20development_92',['Introduction into Android Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'']]], - ['introduction_93',['Introduction',['https://docs.opencv.org/4.2.0/d2/d94/bioinspired_retina.html',1,'Bioinspired Module Retina Introduction'],['https://docs.opencv.org/4.2.0/d2/dbc/cuda_intro.html',1,'CUDA Module Introduction'],['https://docs.opencv.org/4.2.0/d1/dfb/intro.html',1,'Introduction']]], - ['introduction_20into_20android_20development_94',['Introduction into Android Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'']]], - ['introduction_20to_20java_20development_95',['Introduction to Java Development',['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'']]], - ['introduction_20to_20opencv_96',['Introduction to OpenCV',['https://docs.opencv.org/4.2.0/df/d65/tutorial_table_of_content_introduction.html',1,'Introduction to OpenCV'],['https://docs.opencv.org/4.2.0/da/df6/tutorial_py_table_of_contents_setup.html',1,'Introduction to OpenCV']]], - ['introduction_20to_20opencv_20development_20with_20clojure_97',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], - ['introduction_20to_20opencv_20js_98',['Introduction to OpenCV.js',['https://docs.opencv.org/4.2.0/df/df7/tutorial_js_table_of_contents_setup.html',1,'']]], - ['introduction_20to_20opencv_20js_20and_20tutorials_99',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], - ['introduction_20to_20opencv_20python_20tutorials_100',['Introduction to OpenCV-Python Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'']]], - ['introduction_20to_20opencv_20tracker_101',['Introduction to OpenCV Tracker',['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'']]], - ['introduction_20to_20principal_20component_20analysis_20pca_102',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], - ['introduction_20to_20sift_20scale_20invariant_20feature_20transform_103',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], - ['introduction_20to_20support_20vector_20machines_104',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], - ['introduction_20to_20surf_20speeded_20up_20robust_20features_105',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], - ['invariant_20feature_20transform_106',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], - ['ios_107',['iOS',['https://docs.opencv.org/4.2.0/d5/da3/tutorial_ios_install.html',1,'Installation in iOS'],['https://docs.opencv.org/4.2.0/d3/dc9/tutorial_table_of_content_ios.html',1,'OpenCV iOS']]], - ['ios_20hello_108',['OpenCV iOS Hello',['https://docs.opencv.org/4.2.0/d7/d88/tutorial_hello.html',1,'']]], - ['ios_20image_20processing_109',['OpenCV iOS - Image Processing',['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'']]], - ['ios_20video_20processing_110',['OpenCV iOS - Video Processing',['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'']]], - ['its_20use_20for_20image_20processing_111',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]] + ['images_27',['Images',['https://docs.opencv.org/4.2.0/d0/d86/tutorial_py_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d4d/tutorial_js_image_arithmetics.html',1,'Arithmetic Operations on Images'],['https://docs.opencv.org/4.2.0/d3/df2/tutorial_py_basic_ops.html',1,'Basic Operations on Images'],['https://docs.opencv.org/4.2.0/de/d06/tutorial_js_basic_ops.html',1,'Basic Operations on Images'],['https://docs.opencv.org/4.2.0/dd/d53/tutorial_py_depthmap.html',1,'Depth Map from Stereo Images'],['https://docs.opencv.org/4.2.0/da/d6e/tutorial_py_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dd/d52/tutorial_js_geometric_transformations.html',1,'Geometric Transformations of Images'],['https://docs.opencv.org/4.2.0/dc/d2e/tutorial_py_image_display.html',1,'Getting Started with Images'],['https://docs.opencv.org/4.2.0/df/d24/tutorial_js_image_display.html',1,'Getting Started with Images'],['https://docs.opencv.org/4.2.0/dc/dd3/tutorial_gausian_median_blur_bilateral_filter.html',1,'Smoothing Images'],['https://docs.opencv.org/4.2.0/d4/d13/tutorial_py_filtering.html',1,'Smoothing Images'],['https://docs.opencv.org/4.2.0/dd/d6a/tutorial_js_filtering.html',1,'Smoothing Images']]], + ['images_28',['images',['https://docs.opencv.org/4.2.0/dc/da3/tutorial_copyMakeBorder.html',1,'Adding borders to your images'],['https://docs.opencv.org/4.2.0/d5/d98/tutorial_mat_operations.html',1,'Operations with images']]], + ['images_20causing_20optical_20illusions_29',['Processing images causing optical illusions',['https://docs.opencv.org/4.2.0/d7/d8f/tutorial_bioinspired_retina_illusion.html',1,'']]], + ['images_20in_20the_20visual_20studio_20debugger_30',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['images_20lookup_20tables_20and_20time_20measurement_20with_20opencv_31',['How to scan images, lookup tables and time measurement with OpenCV',['https://docs.opencv.org/4.2.0/db/da5/tutorial_how_to_scan_images.html',1,'']]], + ['images_20stitching_20stitching_20module_32',['Images stitching (stitching module)',['https://docs.opencv.org/4.2.0/d0/d33/tutorial_table_of_content_stitching.html',1,'']]], + ['images_20using_20opencv_33',['Adding (blending) two images using OpenCV',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_adding_images.html',1,'']]], + ['images_3a_20multi_20output_34',['Upscaling images: multi-output',['https://docs.opencv.org/4.2.0/d6/dca/tutorial_dnn_superres_upscale_image_multi.html',1,'']]], + ['images_3a_20single_20output_35',['Upscaling images: single-output',['https://docs.opencv.org/4.2.0/d5/d29/tutorial_dnn_superres_upscale_image_single.html',1,'']]], + ['imaging_36',['High Dynamic Range Imaging',['https://docs.opencv.org/4.2.0/d3/db7/tutorial_hdr_imaging.html',1,'']]], + ['imgcodecs_20module_37',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], + ['imgproc_20module_38',['Image Processing (imgproc module)',['https://docs.opencv.org/4.2.0/d7/da8/tutorial_table_of_content_imgproc.html',1,'']]], + ['implementation_20details_39',['Implementation details',['https://docs.opencv.org/4.2.0/d4/ddd/gapi_impl.html',1,'']]], + ['implementing_20a_20face_20beautification_20algorithm_20with_20g_20api_40',['Implementing a face beautification algorithm with G-API',['https://docs.opencv.org/4.2.0/d4/d48/tutorial_gapi_face_beautification.html',1,'']]], + ['import_20reconstruction_41',['Import Reconstruction',['https://docs.opencv.org/4.2.0/de/dfd/tutorial_sfm_import_reconstruction.html',1,'']]], + ['improve_20efficiency_42',['How to enable Halide backend for improve efficiency',['https://docs.opencv.org/4.2.0/de/d37/tutorial_dnn_halide.html',1,'']]], + ['improvement_20techniques_43',['Performance Measurement and Improvement Techniques',['https://docs.opencv.org/4.2.0/dc/d71/tutorial_py_optimization.html',1,'']]], + ['in_20a_20video_44',['Face landmark detection in a video',['https://docs.opencv.org/4.2.0/d8/d3c/tutorial_face_landmark_detection_in_video.html',1,'']]], + ['in_20an_20image_45',['Face landmark detection in an image',['https://docs.opencv.org/4.2.0/d2/d42/tutorial_face_landmark_detection_in_an_image.html',1,'']]], + ['in_20android_20camera_20preview_20based_20cv_20application_46',['Use OpenCL in Android camera preview based CV application',['https://docs.opencv.org/4.2.0/d7/dbd/tutorial_android_ocl_intro.html',1,'']]], + ['in_20browser_47',['How to run deep networks in browser',['https://docs.opencv.org/4.2.0/d5/d86/tutorial_dnn_javascript.html',1,'']]], + ['in_20c_48',['The template and typename keywords in C++',['https://eigen.tuxfamily.org/dox/TopicTemplateKeyword.html',1,'']]], + ['in_20cmake_20projects_49',['Using Eigen in CMake Projects',['https://eigen.tuxfamily.org/dox/TopicCMakeGuide.html',1,'']]], + ['in_20cuda_20kernels_50',['Using Eigen in CUDA kernels',['https://eigen.tuxfamily.org/dox/TopicCUDA.html',1,'']]], + ['in_20eigen_51',['Expression templates in Eigen',['https://eigen.tuxfamily.org/dox/TopicEigenExpressionTemplates.html',1,'']]], + ['in_20fedora_52',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], + ['in_20ios_53',['Installation in iOS',['https://docs.opencv.org/4.2.0/d5/da3/tutorial_ios_install.html',1,'']]], + ['in_20linux_54',['Installation in Linux',['https://docs.opencv.org/4.2.0/d7/d9f/tutorial_linux_install.html',1,'']]], + ['in_20macos_55',['Installation in MacOS',['https://docs.opencv.org/4.2.0/d0/db2/tutorial_macos_install.html',1,'']]], + ['in_20memory_20images_20in_20the_20visual_20studio_20debugger_56',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['in_20node_20js_57',['Using OpenCV.js In Node.js',['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'']]], + ['in_20opencv_58',['in OpenCV',['https://docs.opencv.org/4.2.0/d3/d05/tutorial_py_table_of_contents_contours.html',1,'Contours in OpenCV'],['https://docs.opencv.org/4.2.0/dc/da5/tutorial_py_drawing_functions.html',1,'Drawing Functions in OpenCV'],['https://docs.opencv.org/4.2.0/dc/d4d/tutorial_py_table_of_contents_gui.html',1,'Gui Features in OpenCV'],['https://docs.opencv.org/4.2.0/de/db2/tutorial_py_table_of_contents_histograms.html',1,'Histograms in OpenCV'],['https://docs.opencv.org/4.2.0/d2/d96/tutorial_py_table_of_contents_imgproc.html',1,'Image Processing in OpenCV'],['https://docs.opencv.org/4.2.0/dd/dc4/tutorial_py_table_of_contents_transforms.html',1,'Image Transforms in OpenCV'],['https://docs.opencv.org/4.2.0/d1/d5c/tutorial_py_kmeans_opencv.html',1,'K-Means Clustering in OpenCV']]], + ['in_20opencv_20js_59',['in OpenCV js',['https://docs.opencv.org/4.2.0/d0/d43/tutorial_js_table_of_contents_contours.html',1,'Contours in OpenCV.js'],['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'Histograms in OpenCV.js'],['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'Image Transforms in OpenCV.js']]], + ['in_20subpixels_60',['Detecting corners location in subpixels',['https://docs.opencv.org/4.2.0/dd/d92/tutorial_corner_subpixels.html',1,'']]], + ['in_20the_20visual_20studio_20debugger_61',['Image Watch: viewing in-memory images in the Visual Studio debugger',['https://docs.opencv.org/4.2.0/d4/d14/tutorial_windows_visual_studio_image_watch.html',1,'']]], + ['in_20ubuntu_62',['Install OpenCV-Python in Ubuntu',['https://docs.opencv.org/4.2.0/d2/de6/tutorial_py_setup_in_ubuntu.html',1,'']]], + ['in_20video_20capture_63',['Face Detection in Video Capture',['https://docs.opencv.org/4.2.0/df/d6c/tutorial_js_face_detection_camera.html',1,'']]], + ['in_20windows_64',['in Windows',['https://docs.opencv.org/4.2.0/d5/de5/tutorial_py_setup_in_windows.html',1,'Install OpenCV-Python in Windows'],['https://docs.opencv.org/4.2.0/d3/d52/tutorial_windows_install.html',1,'Installation in Windows']]], + ['in_20your_20image_65',['Finding contours in your image',['https://docs.opencv.org/4.2.0/df/d0d/tutorial_find_contours.html',1,'']]], + ['independent_20elementary_20features_66',['BRIEF (Binary Robust Independent Elementary Features)',['https://docs.opencv.org/4.2.0/dc/d7d/tutorial_py_brief.html',1,'']]], + ['inheriting_20from_20matrix_67',['Inheriting from Matrix',['https://eigen.tuxfamily.org/dox/TopicCustomizing_InheritingMatrix.html',1,'']]], + ['inpainting_68',['Inpainting',['https://docs.opencv.org/4.2.0/df/d3d/tutorial_py_inpainting.html',1,'Image Inpainting'],['https://docs.opencv.org/4.2.0/dc/d2f/tutorial_xphoto_inpainting.html',1,'Image Inpainting']]], + ['inpainting_20using_20f_20transform_69',['Inpainting using F-transform',['https://docs.opencv.org/4.2.0/d3/db8/tutorial_fuzzy_inpainting.html',1,'']]], + ['input_20and_20output_20imgcodecs_20module_70',['Image Input and Output (imgcodecs module)',['https://docs.opencv.org/4.2.0/da/d8f/tutorial_table_of_content_imgcodecs.html',1,'']]], + ['input_20and_20output_20using_20xml_20and_20yaml_20files_71',['File Input and Output using XML and YAML files',['https://docs.opencv.org/4.2.0/dd/d74/tutorial_file_input_output_with_xml_yml.html',1,'']]], + ['input_20and_20output_20videoio_20module_72',['Video Input and Output (videoio module)',['https://docs.opencv.org/4.2.0/df/d2c/tutorial_table_of_content_videoio.html',1,'']]], + ['input_20with_20opencv_20and_20similarity_20measurement_73',['Video Input with OpenCV and similarity measurement',['https://docs.opencv.org/4.2.0/d5/dc4/tutorial_video_input_psnr_ssim.html',1,'']]], + ['inrange_74',['Thresholding Operations using inRange',['https://docs.opencv.org/4.2.0/da/d97/tutorial_threshold_inRange.html',1,'']]], + ['inside_20eigen_20on_20a_20simple_20example_75',['What happens inside Eigen, on a simple example',['https://eigen.tuxfamily.org/dox/TopicInsideEigenExample.html',1,'']]], + ['inside_20the_20microsoft_20visual_20studio_76',['How to build applications with OpenCV inside the "Microsoft Visual Studio"',['https://docs.opencv.org/4.2.0/dd/d6e/tutorial_windows_visual_studio_opencv.html',1,'']]], + ['install_20opencv_20python_20in_20fedora_77',['Install OpenCV-Python in Fedora',['https://docs.opencv.org/4.2.0/dd/dd5/tutorial_py_setup_in_fedora.html',1,'']]], + ['install_20opencv_20python_20in_20ubuntu_78',['Install OpenCV-Python in Ubuntu',['https://docs.opencv.org/4.2.0/d2/de6/tutorial_py_setup_in_ubuntu.html',1,'']]], + ['install_20opencv_20python_20in_20windows_79',['Install OpenCV-Python in Windows',['https://docs.opencv.org/4.2.0/d5/de5/tutorial_py_setup_in_windows.html',1,'']]], + ['installation_80',['SFM module installation',['https://docs.opencv.org/4.2.0/db/db8/tutorial_sfm_installation.html',1,'']]], + ['installation_20by_20using_20git_20bash_20version_202_2014_201_20and_20cmake_20version_203_209_201_81',['Tesseract (master) installation by using git-bash (version>=2.14.1) and cmake (version >=3.9.1)',['https://docs.opencv.org/4.2.0/db/d4c/tutorial_install_tesseract.html',1,'']]], + ['installation_20in_20ios_82',['Installation in iOS',['https://docs.opencv.org/4.2.0/d5/da3/tutorial_ios_install.html',1,'']]], + ['installation_20in_20linux_83',['Installation in Linux',['https://docs.opencv.org/4.2.0/d7/d9f/tutorial_linux_install.html',1,'']]], + ['installation_20in_20macos_84',['Installation in MacOS',['https://docs.opencv.org/4.2.0/d0/db2/tutorial_macos_install.html',1,'']]], + ['installation_20in_20windows_85',['Installation in Windows',['https://docs.opencv.org/4.2.0/d3/d52/tutorial_windows_install.html',1,'']]], + ['intel®_20mkl_20from_20eigen_86',['Using Intel® MKL from Eigen',['https://eigen.tuxfamily.org/dox/TopicUsingIntelMKL.html',1,'']]], + ['intel_20perceptual_20computing_20sdk_20compatible_20depth_20sensors_87',['Using Creative Senz3D and other Intel Perceptual Computing SDK compatible depth sensors',['https://docs.opencv.org/4.2.0/db/d08/tutorial_intelperc.html',1,'']]], + ['interactive_20camera_20calibration_20application_88',['Interactive camera calibration application',['https://docs.opencv.org/4.2.0/d7/d21/tutorial_interactive_calibration.html',1,'']]], + ['interactive_20foreground_20extraction_20using_20grabcut_20algorithm_89',['Interactive Foreground Extraction using GrabCut Algorithm',['https://docs.opencv.org/4.2.0/d8/d83/tutorial_py_grabcut.html',1,'']]], + ['interactive_20visual_20debugging_20of_20computer_20vision_20applications_90',['Interactive Visual Debugging of Computer Vision applications',['https://docs.opencv.org/4.2.0/d7/dcf/tutorial_cvv_introduction.html',1,'']]], + ['into_20android_20development_91',['Introduction into Android Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'']]], + ['introduction_92',['Introduction',['https://docs.opencv.org/4.2.0/d2/d94/bioinspired_retina.html',1,'Bioinspired Module Retina Introduction'],['https://docs.opencv.org/4.2.0/d2/dbc/cuda_intro.html',1,'CUDA Module Introduction'],['https://docs.opencv.org/4.2.0/d1/dfb/intro.html',1,'Introduction']]], + ['introduction_20into_20android_20development_93',['Introduction into Android Development',['https://docs.opencv.org/4.2.0/d9/d3f/tutorial_android_dev_intro.html',1,'']]], + ['introduction_20to_20java_20development_94',['Introduction to Java Development',['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'']]], + ['introduction_20to_20opencv_95',['Introduction to OpenCV',['https://docs.opencv.org/4.2.0/df/d65/tutorial_table_of_content_introduction.html',1,'Introduction to OpenCV'],['https://docs.opencv.org/4.2.0/da/df6/tutorial_py_table_of_contents_setup.html',1,'Introduction to OpenCV']]], + ['introduction_20to_20opencv_20development_20with_20clojure_96',['Introduction to OpenCV Development with Clojure',['https://docs.opencv.org/4.2.0/d7/d1e/tutorial_clojure_dev_intro.html',1,'']]], + ['introduction_20to_20opencv_20js_97',['Introduction to OpenCV.js',['https://docs.opencv.org/4.2.0/df/df7/tutorial_js_table_of_contents_setup.html',1,'']]], + ['introduction_20to_20opencv_20js_20and_20tutorials_98',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], + ['introduction_20to_20opencv_20python_20tutorials_99',['Introduction to OpenCV-Python Tutorials',['https://docs.opencv.org/4.2.0/d0/de3/tutorial_py_intro.html',1,'']]], + ['introduction_20to_20opencv_20tracker_100',['Introduction to OpenCV Tracker',['https://docs.opencv.org/4.2.0/d2/d0a/tutorial_introduction_to_tracker.html',1,'']]], + ['introduction_20to_20principal_20component_20analysis_20pca_101',['Introduction to Principal Component Analysis (PCA)',['https://docs.opencv.org/4.2.0/d1/dee/tutorial_introduction_to_pca.html',1,'']]], + ['introduction_20to_20sift_20scale_20invariant_20feature_20transform_102',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], + ['introduction_20to_20support_20vector_20machines_103',['Introduction to Support Vector Machines',['https://docs.opencv.org/4.2.0/d1/d73/tutorial_introduction_to_svm.html',1,'']]], + ['introduction_20to_20surf_20speeded_20up_20robust_20features_104',['Introduction to SURF (Speeded-Up Robust Features)',['https://docs.opencv.org/4.2.0/df/dd2/tutorial_py_surf_intro.html',1,'']]], + ['invariant_20feature_20transform_105',['Introduction to SIFT (Scale-Invariant Feature Transform)',['https://docs.opencv.org/4.2.0/da/df5/tutorial_py_sift_intro.html',1,'']]], + ['ios_106',['iOS',['https://docs.opencv.org/4.2.0/d5/da3/tutorial_ios_install.html',1,'Installation in iOS'],['https://docs.opencv.org/4.2.0/d3/dc9/tutorial_table_of_content_ios.html',1,'OpenCV iOS']]], + ['ios_20hello_107',['OpenCV iOS Hello',['https://docs.opencv.org/4.2.0/d7/d88/tutorial_hello.html',1,'']]], + ['ios_20image_20processing_108',['OpenCV iOS - Image Processing',['https://docs.opencv.org/4.2.0/d3/def/tutorial_image_manipulation.html',1,'']]], + ['ios_20video_20processing_109',['OpenCV iOS - Video Processing',['https://docs.opencv.org/4.2.0/db/dc8/tutorial_video_processing.html',1,'']]], + ['its_20use_20for_20image_20processing_110',['Discovering the human retina and its use for image processing',['https://docs.opencv.org/4.2.0/df/dee/tutorial_table_of_content_retina.html',1,'']]] ]; diff --git a/search/pages_f.js b/search/pages_f.js index 836193a0..6bfb46be 100644 --- a/search/pages_f.js +++ b/search/pages_f.js @@ -2,7 +2,7 @@ var searchData= [ ['java_20development_0',['Introduction to Java Development',['https://docs.opencv.org/4.2.0/d9/d52/tutorial_java_dev_intro.html',1,'']]], ['java_20with_20eclipse_1',['Using OpenCV Java with Eclipse',['https://docs.opencv.org/4.2.0/d1/d0a/tutorial_java_eclipse.html',1,'']]], - ['js_2',['js',['https://docs.opencv.org/4.2.0/d4/da1/tutorial_js_setup.html',1,'Build OpenCV.js'],['https://docs.opencv.org/4.2.0/d0/d43/tutorial_js_table_of_contents_contours.html',1,'Contours in OpenCV.js'],['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'Histograms in OpenCV.js'],['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'Image Transforms in OpenCV.js'],['https://docs.opencv.org/4.2.0/df/df7/tutorial_js_table_of_contents_setup.html',1,'Introduction to OpenCV.js'],['https://docs.opencv.org/4.2.0/d0/d84/tutorial_js_usage.html',1,'Using OpenCV.js']]], + ['js_2',['js',['https://docs.opencv.org/4.2.0/d4/da1/tutorial_js_setup.html',1,'Build OpenCV.js'],['https://docs.opencv.org/4.2.0/d0/d43/tutorial_js_table_of_contents_contours.html',1,'Contours in OpenCV.js'],['https://docs.opencv.org/4.2.0/d5/dc0/tutorial_js_table_of_contents_histograms.html',1,'Histograms in OpenCV.js'],['https://docs.opencv.org/4.2.0/db/db3/tutorial_js_table_of_contents_transforms.html',1,'Image Transforms in OpenCV.js'],['https://docs.opencv.org/4.2.0/df/df7/tutorial_js_table_of_contents_setup.html',1,'Introduction to OpenCV.js'],['https://docs.opencv.org/4.2.0/d0/d84/tutorial_js_usage.html',1,'Using OpenCV.js'],['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'Using OpenCV.js In Node.js']]], ['js_20and_20tutorials_3',['Introduction to OpenCV.js and Tutorials',['https://docs.opencv.org/4.2.0/df/d0a/tutorial_js_intro.html',1,'']]], ['js_20in_20node_20js_4',['Using OpenCV.js In Node.js',['https://docs.opencv.org/4.2.0/dc/de6/tutorial_js_nodejs.html',1,'']]], ['js_20tutorials_5',['OpenCV.js Tutorials',['https://docs.opencv.org/4.2.0/d5/d10/tutorial_js_root.html',1,'']]] diff --git a/search/variables_10.js b/search/variables_10.js index ad33150f..6ad98d0f 100644 --- a/search/variables_10.js +++ b/search/variables_10.js @@ -1,7 +1,7 @@ var searchData= [ - ['p_0',['p',['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a3c627df1f79609c31cfb83c1044e9d25',1,'cv::AsyncArray::p'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#abbdcc54117a7b1c38826b697e94e9880',1,'cv::AsyncPromise::p'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#aa40f58476d9e54c1c58557f24eede23c',1,'cv::ocl::Context::p'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a6fc4df12367446f46501c676e9d54efc',1,'cv::ocl::Device::p'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html#a1d419e5c3062c54a3846a3d8abcb1634',1,'cv::CvLBPEvaluator::Feature::p'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af263d52c8a81f77e839385e1f6ec1e41',1,'cv::FileStorage::p'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#aa1e8b47ab87b910997f8dea0b5706b4e',1,'cv::ocl::Image2D::p'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a0275f89c9817453bcc4742b725ed00c4',1,'cv::ocl::Kernel::p'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a763e016ef3ff77fbc11620cc1631aab8',1,'cv::MatSize::p'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a6cb6d6a37bd88009069c9f2697397c87',1,'cv::MatStep::p'],['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html#a1eee8a411a7ff4ab839fd3a68c4d7fdb',1,'cv::datasets::MSM_epflObj::p'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#a1d55b26898db3753c73c450ded130268',1,'cv::ocl::Platform::p'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#a333ea49caa52e5f3def72a50f63ab5ac',1,'cv::ocl::PlatformInfo::p'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#acba6c3d3895d4c72a46849efb7570b0b',1,'cv::ocl::Program::p'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a68a27707560a79890587b8960ff25916',1,'cv::ocl::ProgramSource::p'],['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a2c9bd91207e53bcc71ccbe8620193135',1,'cv::QRCodeDetector::p'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#acab7b5c467168f6d2d1bad20dd1356cb',1,'cv::ocl::Queue::p'],['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html#aaa92382a2dc09e77ceea1f1ccb32b448',1,'cv::datasets::SLAM_kittiObj::p'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#ab1673e1dfc3eceaacd568a7ba99258e6',1,'cv::ocl::Timer::p']]], - ['p_1',['P',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3ae14aa4668daf05a4ea6918b10806acd5',1,'cv::ml::SVM']]], + ['p_0',['P',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3ae14aa4668daf05a4ea6918b10806acd5',1,'cv::ml::SVM']]], + ['p_1',['p',['https://docs.opencv.org/4.2.0/d4/d20/classcv_1_1AsyncArray.html#a3c627df1f79609c31cfb83c1044e9d25',1,'cv::AsyncArray::p'],['https://docs.opencv.org/4.2.0/d0/d6b/classcv_1_1AsyncPromise.html#abbdcc54117a7b1c38826b697e94e9880',1,'cv::AsyncPromise::p'],['https://docs.opencv.org/4.2.0/d1/d45/classcv_1_1ocl_1_1Context.html#aa40f58476d9e54c1c58557f24eede23c',1,'cv::ocl::Context::p'],['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#a6fc4df12367446f46501c676e9d54efc',1,'cv::ocl::Device::p'],['https://docs.opencv.org/4.2.0/d7/d3c/classcv_1_1CvLBPEvaluator_1_1Feature.html#a1d419e5c3062c54a3846a3d8abcb1634',1,'cv::CvLBPEvaluator::Feature::p'],['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#af263d52c8a81f77e839385e1f6ec1e41',1,'cv::FileStorage::p'],['https://docs.opencv.org/4.2.0/d0/d4e/classcv_1_1ocl_1_1Image2D.html#aa1e8b47ab87b910997f8dea0b5706b4e',1,'cv::ocl::Image2D::p'],['https://docs.opencv.org/4.2.0/dd/d4c/classcv_1_1ocl_1_1Kernel.html#a0275f89c9817453bcc4742b725ed00c4',1,'cv::ocl::Kernel::p'],['https://docs.opencv.org/4.2.0/df/d63/structcv_1_1MatSize.html#a763e016ef3ff77fbc11620cc1631aab8',1,'cv::MatSize::p'],['https://docs.opencv.org/4.2.0/d4/d26/structcv_1_1MatStep.html#a6cb6d6a37bd88009069c9f2697397c87',1,'cv::MatStep::p'],['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html#a1eee8a411a7ff4ab839fd3a68c4d7fdb',1,'cv::datasets::MSM_epflObj::p'],['https://docs.opencv.org/4.2.0/d8/d87/classcv_1_1ocl_1_1Platform.html#a1d55b26898db3753c73c450ded130268',1,'cv::ocl::Platform::p'],['https://docs.opencv.org/4.2.0/d6/d94/classcv_1_1ocl_1_1PlatformInfo.html#a333ea49caa52e5f3def72a50f63ab5ac',1,'cv::ocl::PlatformInfo::p'],['https://docs.opencv.org/4.2.0/d2/d88/classcv_1_1ocl_1_1Program.html#acba6c3d3895d4c72a46849efb7570b0b',1,'cv::ocl::Program::p'],['https://docs.opencv.org/4.2.0/d5/de3/classcv_1_1ocl_1_1ProgramSource.html#a68a27707560a79890587b8960ff25916',1,'cv::ocl::ProgramSource::p'],['https://docs.opencv.org/4.2.0/de/dc3/classcv_1_1QRCodeDetector.html#a2c9bd91207e53bcc71ccbe8620193135',1,'cv::QRCodeDetector::p'],['https://docs.opencv.org/4.2.0/dd/dc0/classcv_1_1ocl_1_1Queue.html#acab7b5c467168f6d2d1bad20dd1356cb',1,'cv::ocl::Queue::p'],['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html#aaa92382a2dc09e77ceea1f1ccb32b448',1,'cv::datasets::SLAM_kittiObj::p'],['https://docs.opencv.org/4.2.0/df/d4a/classcv_1_1ocl_1_1Timer.html#ab1673e1dfc3eceaacd568a7ba99258e6',1,'cv::ocl::Timer::p']]], ['p0_2',['p0',['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#a8ba422197129718c2d1cfe769f16dae0',1,'cv::CvHOGEvaluator::Feature::p0'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga414eb795c106b63e25d98d0c1d2b817d',1,'cv::stereo::Match::p0'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga414eb795c106b63e25d98d0c1d2b817d',1,'p0(Global Namespace)']]], ['p1_3',['p1',['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#a1ae6805d8ab0fc498b223a6dc446a6cc',1,'cv::CvHOGEvaluator::Feature::p1'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gaf5b87376a1e4002266e1480dd6dd43ff',1,'cv::stereo::Match::p1'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#gaf5b87376a1e4002266e1480dd6dd43ff',1,'p1(Global Namespace)']]], ['p2_4',['p2',['https://docs.opencv.org/4.2.0/de/d11/classcv_1_1CvHOGEvaluator_1_1Feature.html#ab2b8a2754b6b26d4f9e3ff2dd9c08e0d',1,'cv::CvHOGEvaluator::Feature']]], @@ -46,8 +46,8 @@ var searchData= ['pat_43',['pat',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a51cc7ec239bc574f3ba40cd4fe5c9475',1,'cv::datasets::pat'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a51cc7ec239bc574f3ba40cd4fe5c9475',1,'pat(Global Namespace)']]], ['patch_5fsize_5fx_44',['patch_size_x',['https://docs.opencv.org/4.2.0/d2/d04/structcv_1_1cudev_1_1DefaultGlobReducePolicy.html#a1ad0902ac493453c5843538f7fc0ded7a93d9da236bf4870be3428bb928438e5c',1,'cv::cudev::DefaultGlobReducePolicy']]], ['patch_5fsize_5fy_45',['patch_size_y',['https://docs.opencv.org/4.2.0/d2/d04/structcv_1_1cudev_1_1DefaultGlobReducePolicy.html#a1ad0902ac493453c5843538f7fc0ded7a99411a640813e3b8dc222cae869d39c7',1,'cv::cudev::DefaultGlobReducePolicy']]], - ['path_46',['path',['https://docs.opencv.org/4.2.0/d6/d08/structcv_1_1gapi_1_1wip_1_1draw_1_1freetype__font.html#a43b1077a80176caa1c45e4a1eef21d4d',1,'cv::gapi::wip::draw::freetype_font']]], - ['path_47',['PATH',['https://docs.opencv.org/4.2.0/d0/da3/classcv_1_1viz_1_1WTrajectory.html#af448f4e56e68f9d7e1bd1a2c5fce691fa27fc06657f7d3061bd07d6e7192a2006',1,'cv::viz::WTrajectory']]], + ['path_46',['PATH',['https://docs.opencv.org/4.2.0/d0/da3/classcv_1_1viz_1_1WTrajectory.html#af448f4e56e68f9d7e1bd1a2c5fce691fa27fc06657f7d3061bd07d6e7192a2006',1,'cv::viz::WTrajectory']]], + ['path_47',['path',['https://docs.opencv.org/4.2.0/d6/d08/structcv_1_1gapi_1_1wip_1_1draw_1_1freetype__font.html#a43b1077a80176caa1c45e4a1eef21d4d',1,'cv::gapi::wip::draw::freetype_font']]], ['paths_48',['paths',['https://docs.opencv.org/4.2.0/d2/dff/classcv_1_1datasets_1_1FR__adience.html#a7b941899b9f20f8994e1a992e34bacaa',1,'cv::datasets::FR_adience::paths'],['https://docs.opencv.org/4.2.0/da/d69/classcv_1_1datasets_1_1OR__sun.html#a1645e733a08fa9e64d2375d946e3f2de',1,'cv::datasets::OR_sun::paths']]], ['pattern_49',['pattern',['https://docs.opencv.org/4.2.0/dd/db9/structcv_1_1GTransform.html#ad21c88ff36d3cb622e84df46cc06355c',1,'cv::GTransform']]], ['pbu_50',['pBU',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a4e534c3211135d64f80e9d6bbb868c10',1,'NppStInterpolationState']]], @@ -89,8 +89,8 @@ var searchData= ['pnorm_86',['pnorm',['https://docs.opencv.org/4.2.0/dc/df8/classcv_1_1dnn_1_1NormalizeBBoxLayer.html#a3b07f3df5e36c8909fb444bb512614f5',1,'cv::dnn::NormalizeBBoxLayer']]], ['point_5fsize_87',['POINT_SIZE',['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acae2641145d37d70d4f6fa20344295d353',1,'cv::viz::POINT_SIZE'],['https://docs.opencv.org/4.2.0/dc/d5c/group__viz__widget.html#ggae4df8152c2d8639b915eccd0bb90f8acae2641145d37d70d4f6fa20344295d353',1,'POINT_SIZE(Global Namespace)']]], ['pointer_88',['pointer',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#a97e8300b5eafd937dbb1315705f7102b',1,'cv::viz::MouseEvent']]], - ['points_89',['points',['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#aff9d551d70bb7a2d7dfba4c1cce5c01a',1,'cv::gapi::wip::draw::Poly']]], - ['points_90',['POINTS',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8b467f66c33c13df37f24aa3f1196f14',1,'cv::ogl::POINTS'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8b467f66c33c13df37f24aa3f1196f14',1,'POINTS(Global Namespace)']]], + ['points_89',['POINTS',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8b467f66c33c13df37f24aa3f1196f14',1,'cv::ogl::POINTS'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8b467f66c33c13df37f24aa3f1196f14',1,'POINTS(Global Namespace)']]], + ['points_90',['points',['https://docs.opencv.org/4.2.0/d8/d94/structcv_1_1gapi_1_1wip_1_1draw_1_1Poly.html#aff9d551d70bb7a2d7dfba4c1cce5c01a',1,'cv::gapi::wip::draw::Poly']]], ['pointsingrid_91',['pointsInGrid',['https://docs.opencv.org/4.2.0/dd/dd9/structcv_1_1TrackerMedianFlow_1_1Params.html#aa706613abb50ade9d32fff80b84dbfe0',1,'cv::TrackerMedianFlow::Params']]], ['poly_92',['POLY',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#aad7f1aaccced3c33bb256640910a0e56a5fa32d793cd5f5d0bf64f55bb94a3f2e',1,'cv::ml::SVM']]], ['polygon_93',['POLYGON',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8c8c07e1f038e9fe452b06fb80d15c10',1,'cv::ogl::POLYGON'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba8c8c07e1f038e9fe452b06fb80d15c10',1,'POLYGON(Global Namespace)']]], @@ -107,8 +107,8 @@ var searchData= ['poolpad_104',['poolPad',['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html#ace235835cca6ba7b807e8542a8ea9bf1',1,'cv::dnn::MaxUnpoolLayer']]], ['poolstride_105',['poolStride',['https://docs.opencv.org/4.2.0/d1/d59/classcv_1_1dnn_1_1MaxUnpoolLayer.html#a8e1d6155038314c33128a01d6e2472e9',1,'cv::dnn::MaxUnpoolLayer']]], ['popcounttable_106',['popCountTable',['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1b8c26bf1cd9b597cdb9f20501a72f76',1,'cv::popCountTable'],['https://docs.opencv.org/4.2.0/df/d91/group__core__hal__intrin.html#ga1b8c26bf1cd9b597cdb9f20501a72f76',1,'popCountTable(Global Namespace)']]], - ['pos_107',['pos',['https://docs.opencv.org/4.2.0/d4/d6a/structcv_1_1optflow_1_1GPCPatchSample.html#aa1974f4d48d7c895fe29447d29696396',1,'cv::optflow::GPCPatchSample::pos'],['https://docs.opencv.org/4.2.0/d8/d7d/structcv_1_1datasets_1_1IR__robotObj.html#a3fce07cd1c3d3087d39099669651cab2',1,'cv::datasets::IR_robotObj::pos'],['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a1b88e497f772a9b1c18b66523b75efc9',1,'NppStInterpolationState::pos']]], - ['pos_108',['POS',['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba5d7a482a7505fa7d961f2e61643b7bc1',1,'cv::datasets::POS'],['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba5d7a482a7505fa7d961f2e61643b7bc1',1,'POS(Global Namespace)']]], + ['pos_107',['POS',['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba5d7a482a7505fa7d961f2e61643b7bc1',1,'cv::datasets::POS'],['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba5d7a482a7505fa7d961f2e61643b7bc1',1,'POS(Global Namespace)']]], + ['pos_108',['pos',['https://docs.opencv.org/4.2.0/d4/d6a/structcv_1_1optflow_1_1GPCPatchSample.html#aa1974f4d48d7c895fe29447d29696396',1,'cv::optflow::GPCPatchSample::pos'],['https://docs.opencv.org/4.2.0/d8/d7d/structcv_1_1datasets_1_1IR__robotObj.html#a3fce07cd1c3d3087d39099669651cab2',1,'cv::datasets::IR_robotObj::pos'],['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a1b88e497f772a9b1c18b66523b75efc9',1,'NppStInterpolationState::pos']]], ['pose_109',['pose',['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#a96deeb2b971ea1d9d47188f39d64118a',1,'cv::datasets::GR_skigObj::pose'],['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#ad90bbb2454858374c66f12016a85380b',1,'cv::datasets::PascalObj::pose'],['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#a20e16c79d3e967f864641d0e618284a5',1,'cv::ppf_match_3d::Pose3D::pose'],['https://docs.opencv.org/4.2.0/d1/db5/structcv_1_1multicalib_1_1MultiCameraCalibration_1_1vertex.html#af373b82a65b00e9d632317b47e6cf0f2',1,'cv::multicalib::MultiCameraCalibration::vertex::pose']]], ['poselist_110',['poseList',['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a84383c0098dac446b5ef9338a2c294ba',1,'cv::ppf_match_3d::PoseCluster3D']]], ['posesarray_111',['posesArray',['https://docs.opencv.org/4.2.0/da/df4/structcv_1_1datasets_1_1SLAM__kittiObj.html#abbc38afefaaddd2a451a62e8419581a4',1,'cv::datasets::SLAM_kittiObj']]], diff --git a/search/variables_12.js b/search/variables_12.js index b14d7d31..25155df8 100644 --- a/search/variables_12.js +++ b/search/variables_12.js @@ -1,7 +1,7 @@ var searchData= [ - ['r_0',['r',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1datasets_1_1MSM__middleburyObj.html#ac6e479e646f3e3b0babffa0e9225be70',1,'cv::datasets::MSM_middleburyObj::r'],['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a65576ef7daf7c86e056b42b34a80520f',1,'cv::detail::tracked_cv_mat::r'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a6a9a4f76fd04649d4d5fa85f56b3cfae',1,'cv::detail::tracked_cv_umat::r']]], - ['r_1',['R',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#ab1fe6908cde4a9662e20f03e7dfcc272',1,'cv::detail::CameraParams::R'],['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html#a523237291402f020dd17d37e15321c40',1,'cv::face::FacemarkAAM::Config::R']]], + ['r_0',['R',['https://docs.opencv.org/4.2.0/d4/d0a/structcv_1_1detail_1_1CameraParams.html#ab1fe6908cde4a9662e20f03e7dfcc272',1,'cv::detail::CameraParams::R'],['https://docs.opencv.org/4.2.0/d0/ded/structcv_1_1face_1_1FacemarkAAM_1_1Config.html#a523237291402f020dd17d37e15321c40',1,'cv::face::FacemarkAAM::Config::R']]], + ['r_1',['r',['https://docs.opencv.org/4.2.0/d9/da0/structcv_1_1datasets_1_1MSM__middleburyObj.html#ac6e479e646f3e3b0babffa0e9225be70',1,'cv::datasets::MSM_middleburyObj::r'],['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a65576ef7daf7c86e056b42b34a80520f',1,'cv::detail::tracked_cv_mat::r'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a6a9a4f76fd04649d4d5fa85f56b3cfae',1,'cv::detail::tracked_cv_umat::r']]], ['r_5fkinv_2',['r_kinv',['https://docs.opencv.org/4.2.0/dc/d2c/structcv_1_1detail_1_1ProjectorBase.html#a2f30b2a02c9fddf1bacb47a805b00c82',1,'cv::detail::ProjectorBase']]], ['radius_3',['radius',['https://docs.opencv.org/4.2.0/d8/d07/structcv_1_1gapi_1_1wip_1_1draw_1_1Circle.html#acd0e72c915d2099cadcf27a76f041632',1,'cv::gapi::wip::draw::Circle']]], ['radius_5f_4',['radius_',['https://docs.opencv.org/4.2.0/dd/d05/classcv_1_1videostab_1_1DeblurerBase.html#a0af57e0803cb6bc72610185bb837fb58',1,'cv::videostab::DeblurerBase::radius_'],['https://docs.opencv.org/4.2.0/d5/d00/classcv_1_1videostab_1_1InpainterBase.html#a2300c582c556d8e74329abe28f6d08ea',1,'cv::videostab::InpainterBase::radius_'],['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#a9fceea8c4e22b8bbca30561d1a309e2e',1,'cv::videostab::StabilizerBase::radius_']]], @@ -78,8 +78,8 @@ var searchData= ['rgbd_5fplane_5fmethod_5fdefault_75',['RGBD_PLANE_METHOD_DEFAULT',['https://docs.opencv.org/4.2.0/d6/d50/classcv_1_1rgbd_1_1RgbdPlane.html#ab6521f3b1414cca7e1763878d7f508bca3ba35c16d774ce9c38011434e7423abb',1,'cv::rgbd::RgbdPlane']]], ['rho_76',['RHO',['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggaaedb1f94e6b143cef163622c531afd88a6bba1f5405e6fcc199a6265d9b146359',1,'cv::RHO'],['https://docs.opencv.org/4.2.0/d9/d0c/group__calib3d.html#ggaaedb1f94e6b143cef163622c531afd88a6bba1f5405e6fcc199a6265d9b146359',1,'RHO(Global Namespace)']]], ['rhs_77',['rhs',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#afb31bae949ea257303d8a03dfb696315',1,'cv::optflow::GPCTree::Node']]], - ['right_78',['right',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#aee7ad615c118d559c9606c5bb98467ac',1,'cv::optflow::GPCTree::Node::right'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#aef80dc1796c5c0a694482af8dc63ae99',1,'cv::ml::DTrees::Node::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_ios< char, _Traits >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_iostream< char >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_istream< char >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_istream< char, _Traits >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_ostream< char >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_ostream< char, _Traits >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_fstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ifstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ios::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_iostream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_istream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_istringstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ofstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ostream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ostringstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_stringstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::ios_base::right'],['../structkinematics_1_1gearpos__t.html#a269b54a5ab18fb7ff52ccf1ff4c6032f',1,'kinematics::gearpos_t::right']]], - ['right_79',['RIGHT',['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a025fb89c3d3b2972d36c728381ebc50e',1,'cv::datasets::RIGHT'],['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a025fb89c3d3b2972d36c728381ebc50e',1,'RIGHT(Global Namespace)']]], + ['right_78',['RIGHT',['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a025fb89c3d3b2972d36c728381ebc50e',1,'cv::datasets::RIGHT'],['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a025fb89c3d3b2972d36c728381ebc50e',1,'RIGHT(Global Namespace)']]], + ['right_79',['right',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#aee7ad615c118d559c9606c5bb98467ac',1,'cv::optflow::GPCTree::Node::right'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#aef80dc1796c5c0a694482af8dc63ae99',1,'cv::ml::DTrees::Node::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_ios< char, _Traits >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_iostream< char >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_istream< char >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_istream< char, _Traits >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_ostream< char >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'basic_ostream< char, _Traits >::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_fstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ifstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ios::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_iostream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_istream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_istringstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ofstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ostream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_ostringstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::basic_stringstream::right'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a13753798f5c9da6f9372429c53039767',1,'std::ios_base::right'],['../structkinematics_1_1gearpos__t.html#a269b54a5ab18fb7ff52ccf1ff4c6032f',1,'kinematics::gearpos_t::right']]], ['rightbutton_80',['RightButton',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#ada240f2528500ad1615e76fb2fd9e2baa3535bdc55ffcd7ad9f7b79e210bbe6a9',1,'cv::viz::MouseEvent']]], ['rightleft_81',['rightleft',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76abf87d06fd32f99f20821216e5f768287',1,'cv::datasets::rightleft'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76abf87d06fd32f99f20821216e5f768287',1,'rightleft(Global Namespace)']]], ['rigid_5fbody_5fmotion_82',['RIGID_BODY_MOTION',['https://docs.opencv.org/4.2.0/df/ddc/classcv_1_1rgbd_1_1Odometry.html#a25c82843207af8c3e2a133dc5c887f8da754692ca9d6cadbc925cc7ce2337ed95',1,'cv::rgbd::Odometry']]], diff --git a/search/variables_13.js b/search/variables_13.js index 11893449..ecf6fb6f 100644 --- a/search/variables_13.js +++ b/search/variables_13.js @@ -1,7 +1,7 @@ var searchData= [ - ['s_0',['s',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a41e897e2deb89c8caa169194f87c2a73',1,'cv::MatExpr::s'],['https://docs.opencv.org/4.2.0/d4/d66/structcv_1_1datasets_1_1skeleton.html#a5d353fe702215021f6d753393b80a055',1,'cv::datasets::skeleton::s']]], - ['s_1',['S',['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#a29a25d70c8b7090fc0bba855ec42696c',1,'cv::face::FacemarkAAM::Model']]], + ['s_0',['S',['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#a29a25d70c8b7090fc0bba855ec42696c',1,'cv::face::FacemarkAAM::Model']]], + ['s_1',['s',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a41e897e2deb89c8caa169194f87c2a73',1,'cv::MatExpr::s'],['https://docs.opencv.org/4.2.0/d4/d66/structcv_1_1datasets_1_1skeleton.html#a5d353fe702215021f6d753393b80a055',1,'cv::datasets::skeleton::s']]], ['s0_2',['s0',['https://docs.opencv.org/4.2.0/de/d4f/structcv_1_1face_1_1FacemarkAAM_1_1Data.html#a970606e00ede24bd01b33e9b7e4053d2',1,'cv::face::FacemarkAAM::Data::s0'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#a5829fa9198c6a27fb3a13a17a34dc2f9',1,'cv::face::FacemarkAAM::Model::s0']]], ['same_3',['same',['https://docs.opencv.org/4.2.0/d9/d2d/structcv_1_1datasets_1_1FR__lfwObj.html#a04ac85de3dca6204b996cfb8c0137eb8',1,'cv::datasets::FR_lfwObj']]], ['sampled_5fpc_4',['sampled_pc',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a3e71be57a3b21bd7bcdc64debfa28c7d',1,'cv::ppf_match_3d::PPF3DDetector']]], @@ -167,8 +167,8 @@ var searchData= ['startpointy_164',['startPointY',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#ac36c0fe32df87388d9fa6a8def75f7e4',1,'cv::line_descriptor::KeyLine']]], ['state_165',['state',['https://docs.opencv.org/4.2.0/da/d56/classcv_1_1FileStorage.html#aa53ac52fa536aeabba795a2164a11337',1,'cv::FileStorage::state'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#a993bd2e6a5a9b8f3b37ba6049b523136',1,'cv::RNG::state']]], ['stateestimator_166',['stateEstimator',['https://docs.opencv.org/4.2.0/d0/dfc/classcv_1_1TrackerModel.html#ab25e2e36eaba6e155f7227712e8ff178',1,'cv::TrackerModel']]], - ['statefuncjacobianw_167',['stateFuncJacobianW',['../classfilters_1_1ExtendedKalmanFilter.html#ac476587c0045b7382b0fb62c4323c26c',1,'filters::ExtendedKalmanFilter']]], - ['statefuncjacobianx_168',['stateFuncJacobianX',['../classfilters_1_1ExtendedKalmanFilter.html#ac4661be6187111039f681ef5afb8a233',1,'filters::ExtendedKalmanFilter']]], + ['statefuncjacobianw_167',['stateFuncJacobianW',['../classfilters_1_1ExtendedKalmanFilter.html#a892d03b2d44ad670f6e592c68d2fe912',1,'filters::ExtendedKalmanFilter']]], + ['statefuncjacobianx_168',['stateFuncJacobianX',['../classfilters_1_1ExtendedKalmanFilter.html#a28ebe1ffdb671ba81ea92a833aafaaae',1,'filters::ExtendedKalmanFilter']]], ['stateinit_169',['stateInit',['https://docs.opencv.org/4.2.0/da/d73/classcv_1_1tracking_1_1UnscentedKalmanFilterParams.html#a5e0d0f4982531e761f8934c97fe15689',1,'cv::tracking::UnscentedKalmanFilterParams']]], ['statepost_170',['statePost',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#add8fb5ac9c04b4600b679698dcb0447d',1,'cv::KalmanFilter']]], ['statepre_171',['statePre',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a926dece64b4e0e28c3f58af8b7793669',1,'cv::KalmanFilter']]], diff --git a/search/variables_14.js b/search/variables_14.js index 944ed447..89efa443 100644 --- a/search/variables_14.js +++ b/search/variables_14.js @@ -46,8 +46,8 @@ var searchData= ['thresh_5ftozero_5finv_43',['THRESH_TOZERO_INV',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a47518a30aae90d799035bdcf0bb39a50',1,'cv::THRESH_TOZERO_INV'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a47518a30aae90d799035bdcf0bb39a50',1,'THRESH_TOZERO_INV(Global Namespace)']]], ['thresh_5ftriangle_44',['THRESH_TRIANGLE',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a22ffcf680811aed95be6c7f5cd809621',1,'cv::THRESH_TRIANGLE'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576a22ffcf680811aed95be6c7f5cd809621',1,'THRESH_TRIANGLE(Global Namespace)']]], ['thresh_5ftrunc_45',['THRESH_TRUNC',['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576ac7e89a5e95490116e7d2082b3096b2b8',1,'cv::THRESH_TRUNC'],['https://docs.opencv.org/4.2.0/d7/d1b/group__imgproc__misc.html#ggaa9e58d2860d4afa658ef70a9b1115576ac7e89a5e95490116e7d2082b3096b2b8',1,'THRESH_TRUNC(Global Namespace)']]], - ['threshold_46',['threshold',['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#a154e5064920beded03b54bd4e542665f',1,'cv::face::StandardCollector']]], - ['threshold_47',['THRESHOLD',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#aeb231abf4b24747a3e2f6ca4d99132caa8d01c1ae87944f51bfc772f7302d7b6d',1,'cv::AgastFeatureDetector::THRESHOLD'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#aadc316b5df92d9e457c9c984f1bab7eea86ae705d0195c26863b5284ffd6a1066',1,'cv::FastFeatureDetector::THRESHOLD']]], + ['threshold_46',['THRESHOLD',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#aeb231abf4b24747a3e2f6ca4d99132caa8d01c1ae87944f51bfc772f7302d7b6d',1,'cv::AgastFeatureDetector::THRESHOLD'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#aadc316b5df92d9e457c9c984f1bab7eea86ae705d0195c26863b5284ffd6a1066',1,'cv::FastFeatureDetector::THRESHOLD']]], + ['threshold_47',['threshold',['https://docs.opencv.org/4.2.0/d4/d8d/classcv_1_1face_1_1StandardCollector.html#a154e5064920beded03b54bd4e542665f',1,'cv::face::StandardCollector']]], ['thresholdoff_48',['thresholdOFF',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#af72cef13be6c98a37de23c9beb0c816f',1,'cv::bioinspired::SegmentationParameters']]], ['thresholdon_49',['thresholdON',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#a50eb9d7781953ddd353f54f26ba89603',1,'cv::bioinspired::SegmentationParameters']]], ['thresholdstep_50',['thresholdStep',['https://docs.opencv.org/4.2.0/d8/da7/structcv_1_1SimpleBlobDetector_1_1Params.html#a7fdc3403eb1a826bebc661dd9724faf9',1,'cv::SimpleBlobDetector::Params']]], @@ -103,34 +103,33 @@ var searchData= ['triangle_100',['triangle',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a26c349619f95531945f6c0c7a24dedea',1,'cv::datasets::triangle'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a26c349619f95531945f6c0c7a24dedea',1,'triangle(Global Namespace)']]], ['triangle_5ffan_101',['TRIANGLE_FAN',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba1778386fd1796017cf36965339b27cf7',1,'cv::ogl::TRIANGLE_FAN'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aaba1778386fd1796017cf36965339b27cf7',1,'TRIANGLE_FAN(Global Namespace)']]], ['triangle_5fstrip_102',['TRIANGLE_STRIP',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabae656afaa0987fa2f044e3fdc260aa140',1,'cv::ogl::TRIANGLE_STRIP'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabae656afaa0987fa2f044e3fdc260aa140',1,'TRIANGLE_STRIP(Global Namespace)']]], - ['triangles_103',['triangles',['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#a026fc525e61c2e0a72fc738ccc947601',1,'cv::face::FacemarkAAM::Model']]], - ['triangles_104',['TRIANGLES',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabab2fc9178ebe34e531f1451751e673c7d',1,'cv::ogl::TRIANGLES'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabab2fc9178ebe34e531f1451751e673c7d',1,'TRIANGLES(Global Namespace)']]], - ['triangularview_105',['triangularView',['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#aacba330c3a12d1cac75c2f9df8c0f347',1,'Eigen::SelfAdjointView::triangularView'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SelfAdjointView.html#aacba330c3a12d1cac75c2f9df8c0f347',1,'SelfAdjointView< const Derived, UpLo >::triangularView']]], - ['trimratio_5f_106',['trimRatio_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#acd5ad58425a94dd6af0a29b98ee5517c',1,'cv::videostab::StabilizerBase']]], - ['trunc_107',['trunc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_ios< char, _Traits >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_iostream< char >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_istream< char >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_istream< char, _Traits >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_ostream< char >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_ostream< char, _Traits >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_fstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ifstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ios::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_iostream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_istream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_istringstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ofstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ostream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ostringstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_stringstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::ios_base::trunc']]], - ['truncated_108',['truncated',['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#a19f8baa131256e8532657f6a3265d5bb',1,'cv::datasets::PascalObj']]], - ['truncatethreshold_109',['truncateThreshold',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a7a4ff0e74b36ecb1e4be57ff1865ae56',1,'cv::dynafu::Params::truncateThreshold'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#ae813e8429d58751cf4deb56ae7362ee4',1,'cv::kinfu::Params::truncateThreshold']]], - ['try_5fto_5flock_110',['try_to_lock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga05e641e1ecba98edb6fa4714a6c03e0d',1,'std::try_to_lock'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga05e641e1ecba98edb6fa4714a6c03e0d',1,'try_to_lock(Global Namespace)']]], - ['tsdf_5fmax_5fweight_111',['tsdf_max_weight',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a74d018302877a5d279f203982219c4a7',1,'cv::dynafu::Params::tsdf_max_weight'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a9753dcad7d91c98985b606cf4b5a90b1',1,'cv::kinfu::Params::tsdf_max_weight']]], - ['tsdf_5fmin_5fcamera_5fmovement_112',['tsdf_min_camera_movement',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a8dea18215b11c8c469951f86bcb9fe48',1,'cv::dynafu::Params::tsdf_min_camera_movement'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a07a71c122207f4ecf95f42a83d6dbc48',1,'cv::kinfu::Params::tsdf_min_camera_movement']]], - ['tsdf_5ftrunc_5fdist_113',['tsdf_trunc_dist',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#abdfef009310c1cab3935e3210b6fc87f',1,'cv::dynafu::Params::tsdf_trunc_dist'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a16ea51cf7e543a0be9dfd7d320303627',1,'cv::kinfu::Params::tsdf_trunc_dist']]], - ['turnaround_114',['turnaround',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a39055bc42fd5822e8a3a2c9639c3612a',1,'cv::datasets::turnaround'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a39055bc42fd5822e8a3a2c9639c3612a',1,'turnaround(Global Namespace)']]], - ['type_115',['type',['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html#a8cadd5042039048f71cf93b124bd6ae1',1,'cv::gapi::fluid::Border::type'],['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#ae716a59c79a20a2a2660096d1dd47b18',1,'cv::datasets::GR_skigObj::type'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a5f3cdb2524e281094e14e212a76a2d38',1,'cv::dnn::Layer::type'],['https://docs.opencv.org/4.2.0/db/db6/classcv_1_1dnn_1_1LayerParams.html#a0dbcba5635f513704ca7adc9cf6eff78',1,'cv::dnn::LayerParams::type'],['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#a3e337cb0a0f44b15570db74e19734319',1,'cv::dnn::LRNLayer::type'],['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#aeb8ea847034d9ffc4383463b8bc9cf51',1,'cv::viz::MouseEvent::type'],['https://docs.opencv.org/4.2.0/db/d0d/structcv_1_1ParamType_3_01__Tp_00_01typename_01std_1_1enable__if_3_01std_1_1is__enum_3_01__Tp_01_4_1_1value_01_4_1_1type_01_4.html#a755920f56cc55a3b84639a239cd8a693',1,'cv::ParamType< _Tp, typename std::enable_if< std::is_enum< _Tp >::value >::type >::type'],['https://docs.opencv.org/4.2.0/d2/d39/structcv_1_1ParamType_3_01Algorithm_01_4.html#a9beda664abde9aea9f7fff830efd45d5',1,'cv::ParamType< Algorithm >::type'],['https://docs.opencv.org/4.2.0/d1/d87/structcv_1_1ParamType_3_01bool_01_4.html#a5610b45e4cd056719b4adcce0eb3ca6d',1,'cv::ParamType< bool >::type'],['https://docs.opencv.org/4.2.0/d4/d98/structcv_1_1ParamType_3_01double_01_4.html#a660d6da1905d6629a751bc7f42e9385d',1,'cv::ParamType< double >::type'],['https://docs.opencv.org/4.2.0/dd/df2/structcv_1_1ParamType_3_01float_01_4.html#a92a7b876f64901f0de84324ee6cbc591',1,'cv::ParamType< float >::type'],['https://docs.opencv.org/4.2.0/db/d5f/structcv_1_1ParamType_3_01Mat_01_4.html#af3d584cd4298ae018142ef42646cc10a',1,'cv::ParamType< Mat >::type'],['https://docs.opencv.org/4.2.0/d2/dda/structcv_1_1ParamType_3_01Scalar_01_4.html#a7fc7375ade85917f5ced53fe367dc32b',1,'cv::ParamType< Scalar >::type'],['https://docs.opencv.org/4.2.0/dc/d1c/structcv_1_1ParamType_3_01std_1_1vector_3_01Mat_01_4_01_4.html#aa6210114e54ac35e2477513ecb02ea2a',1,'cv::ParamType< std::vector< Mat > >::type'],['https://docs.opencv.org/4.2.0/d0/d5f/structcv_1_1ParamType_3_01String_01_4.html#a8bbf1a9470dc13d3a3dff28e03a026a1',1,'cv::ParamType< String >::type'],['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1ParamType_3_01uchar_01_4.html#adf7b7b3ab6eb496d6817b093e4fcb09e',1,'cv::ParamType< uchar >::type'],['https://docs.opencv.org/4.2.0/dc/d63/structcv_1_1ParamType_3_01uint64_01_4.html#a9592ae25ee7b861fe339eb07bd4d10ed',1,'cv::ParamType< uint64 >::type'],['https://docs.opencv.org/4.2.0/d7/d68/structcv_1_1ParamType_3_01unsigned_01_4.html#a4f8b9f217561fdd22bca401c47526b62',1,'cv::ParamType< unsigned >::type'],['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a0cb63164efd77bbfabd77ff68ea5ce8d',1,'cv::dnn::PoolingLayer::type'],['https://docs.opencv.org/4.2.0/d7/d56/structcv_1_1datasets_1_1SLAM__tumindoorObj.html#a351c8eb553d89b00cb00a6dac0cd2107',1,'cv::datasets::SLAM_tumindoorObj::type'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a1ab7160b93aac1aa5ae015560d6fa5ae',1,'cv::TermCriteria::type'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a908ed821dcfd03b5cd1de763885537a3',1,'cv::Subdiv2D::Vertex::type']]], - ['type1_116',['type1',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#a32db8f0b08a582326de2ecc1e2baea10',1,'cv::datasets::HPE_humanevaObj']]], - ['type2_117',['type2',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#a6f03ab1a7944ee6a50a81404b8760e77',1,'cv::datasets::HPE_humanevaObj']]], - ['type_5f5_5f8_118',['TYPE_5_8',['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08a16aa140499fc16449dfae5f095dc475c',1,'cv::FastFeatureDetector']]], - ['type_5f7_5f12_119',['TYPE_7_12',['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08af4be71a038c46401a0b431fcc994900d',1,'cv::FastFeatureDetector']]], - ['type_5f9_5f16_120',['TYPE_9_16',['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08a7a1af523673c330d43ec47081bcc55e3',1,'cv::FastFeatureDetector']]], - ['type_5faccelerator_121',['TYPE_ACCELERATOR',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2a3e0bdde0459301ccb652c1387997ae07',1,'cv::ocl::Device']]], - ['type_5fall_122',['TYPE_ALL',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2af32644a14837526000cb67fe3331fa10',1,'cv::ocl::Device']]], - ['type_5fcpu_123',['TYPE_CPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2ae3f66c5131806996dd0a77dcc27b5cdb',1,'cv::ocl::Device']]], - ['type_5fdefault_124',['TYPE_DEFAULT',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2a85e501bfc1d0b86cc5a00b3231169594',1,'cv::ocl::Device']]], - ['type_5fdgpu_125',['TYPE_DGPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2ade0b46bcd7730a122fc2db365d46f134',1,'cv::ocl::Device']]], - ['type_5ffun_126',['TYPE_FUN',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a76e4e851a896def5b60f25367f44ac6f',1,'cv::instr']]], - ['type_5fgeneral_127',['TYPE_GENERAL',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a289321828657503ab1539ad17904a925',1,'cv::instr']]], - ['type_5fgpu_128',['TYPE_GPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2aeb33963824886f155640fbcaef41d31f',1,'cv::ocl::Device']]], - ['type_5figpu_129',['TYPE_IGPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2a5a9bc4ea9b8ef84cd24a3289e4bd2d9d',1,'cv::ocl::Device']]], - ['type_5fmarker_130',['TYPE_MARKER',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a0025497a8b803c1564fa60d01c628247',1,'cv::instr']]], - ['type_5fmask_131',['TYPE_MASK',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a7367dc60b8963971f3c8f34dc075ebd6',1,'cv::FileNode::TYPE_MASK'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa6207c8cf9a3e442f153dc0241aea600a03b3e6a1defa1189b67c9f3d70b7c448',1,'cv::Mat::TYPE_MASK'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a6ecf93c4dac94616b02918ad5b3892d5abb9b861c1d3e39f5d4194c49c44c3c90',1,'cv::gapi::own::detail::MatHeader::TYPE_MASK'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a253082dc73b6e195968b5cd6ad10c71bacfda75d2f03eb3b2dc71e9654b5bef46',1,'cv::UMat::TYPE_MASK']]], - ['type_5fwrapper_132',['TYPE_WRAPPER',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a3bb468f2996912301469d76be784c183',1,'cv::instr']]] + ['triangles_103',['TRIANGLES',['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabab2fc9178ebe34e531f1451751e673c7d',1,'cv::ogl::TRIANGLES'],['https://docs.opencv.org/4.2.0/d2/d3c/group__core__opengl.html#ggaf53526c205a92260f356fe6589460aabab2fc9178ebe34e531f1451751e673c7d',1,'TRIANGLES(Global Namespace)']]], + ['triangles_104',['triangles',['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1face_1_1FacemarkAAM_1_1Model.html#a026fc525e61c2e0a72fc738ccc947601',1,'cv::face::FacemarkAAM::Model']]], + ['trimratio_5f_105',['trimRatio_',['https://docs.opencv.org/4.2.0/d2/d6c/classcv_1_1videostab_1_1StabilizerBase.html#acd5ad58425a94dd6af0a29b98ee5517c',1,'cv::videostab::StabilizerBase']]], + ['trunc_106',['trunc',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_ios< char, _Traits >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_iostream< char >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_istream< char >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_istream< char, _Traits >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_ostream< char >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'basic_ostream< char, _Traits >::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_fstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ifstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ios::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_iostream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_istream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_istringstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ofstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ostream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_ostringstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::basic_stringstream::trunc'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ae6831a611ce41b51a873c55b30d8534d',1,'std::ios_base::trunc']]], + ['truncated_107',['truncated',['https://docs.opencv.org/4.2.0/de/d1c/structcv_1_1datasets_1_1PascalObj.html#a19f8baa131256e8532657f6a3265d5bb',1,'cv::datasets::PascalObj']]], + ['truncatethreshold_108',['truncateThreshold',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a7a4ff0e74b36ecb1e4be57ff1865ae56',1,'cv::dynafu::Params::truncateThreshold'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#ae813e8429d58751cf4deb56ae7362ee4',1,'cv::kinfu::Params::truncateThreshold']]], + ['try_5fto_5flock_109',['try_to_lock',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga05e641e1ecba98edb6fa4714a6c03e0d',1,'std::try_to_lock'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01504.html#ga05e641e1ecba98edb6fa4714a6c03e0d',1,'try_to_lock(Global Namespace)']]], + ['tsdf_5fmax_5fweight_110',['tsdf_max_weight',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a74d018302877a5d279f203982219c4a7',1,'cv::dynafu::Params::tsdf_max_weight'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a9753dcad7d91c98985b606cf4b5a90b1',1,'cv::kinfu::Params::tsdf_max_weight']]], + ['tsdf_5fmin_5fcamera_5fmovement_111',['tsdf_min_camera_movement',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a8dea18215b11c8c469951f86bcb9fe48',1,'cv::dynafu::Params::tsdf_min_camera_movement'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a07a71c122207f4ecf95f42a83d6dbc48',1,'cv::kinfu::Params::tsdf_min_camera_movement']]], + ['tsdf_5ftrunc_5fdist_112',['tsdf_trunc_dist',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#abdfef009310c1cab3935e3210b6fc87f',1,'cv::dynafu::Params::tsdf_trunc_dist'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a16ea51cf7e543a0be9dfd7d320303627',1,'cv::kinfu::Params::tsdf_trunc_dist']]], + ['turnaround_113',['turnaround',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a39055bc42fd5822e8a3a2c9639c3612a',1,'cv::datasets::turnaround'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76a39055bc42fd5822e8a3a2c9639c3612a',1,'turnaround(Global Namespace)']]], + ['type_114',['type',['https://docs.opencv.org/4.2.0/db/deb/structcv_1_1gapi_1_1fluid_1_1Border.html#a8cadd5042039048f71cf93b124bd6ae1',1,'cv::gapi::fluid::Border::type'],['https://docs.opencv.org/4.2.0/d6/d4b/structcv_1_1datasets_1_1GR__skigObj.html#ae716a59c79a20a2a2660096d1dd47b18',1,'cv::datasets::GR_skigObj::type'],['https://docs.opencv.org/4.2.0/d3/d6c/classcv_1_1dnn_1_1Layer.html#a5f3cdb2524e281094e14e212a76a2d38',1,'cv::dnn::Layer::type'],['https://docs.opencv.org/4.2.0/db/db6/classcv_1_1dnn_1_1LayerParams.html#a0dbcba5635f513704ca7adc9cf6eff78',1,'cv::dnn::LayerParams::type'],['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#a3e337cb0a0f44b15570db74e19734319',1,'cv::dnn::LRNLayer::type'],['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#aeb8ea847034d9ffc4383463b8bc9cf51',1,'cv::viz::MouseEvent::type'],['https://docs.opencv.org/4.2.0/db/d0d/structcv_1_1ParamType_3_01__Tp_00_01typename_01std_1_1enable__if_3_01std_1_1is__enum_3_01__Tp_01_4_1_1value_01_4_1_1type_01_4.html#a755920f56cc55a3b84639a239cd8a693',1,'cv::ParamType< _Tp, typename std::enable_if< std::is_enum< _Tp >::value >::type >::type'],['https://docs.opencv.org/4.2.0/d2/d39/structcv_1_1ParamType_3_01Algorithm_01_4.html#a9beda664abde9aea9f7fff830efd45d5',1,'cv::ParamType< Algorithm >::type'],['https://docs.opencv.org/4.2.0/d1/d87/structcv_1_1ParamType_3_01bool_01_4.html#a5610b45e4cd056719b4adcce0eb3ca6d',1,'cv::ParamType< bool >::type'],['https://docs.opencv.org/4.2.0/d4/d98/structcv_1_1ParamType_3_01double_01_4.html#a660d6da1905d6629a751bc7f42e9385d',1,'cv::ParamType< double >::type'],['https://docs.opencv.org/4.2.0/dd/df2/structcv_1_1ParamType_3_01float_01_4.html#a92a7b876f64901f0de84324ee6cbc591',1,'cv::ParamType< float >::type'],['https://docs.opencv.org/4.2.0/db/d5f/structcv_1_1ParamType_3_01Mat_01_4.html#af3d584cd4298ae018142ef42646cc10a',1,'cv::ParamType< Mat >::type'],['https://docs.opencv.org/4.2.0/d2/dda/structcv_1_1ParamType_3_01Scalar_01_4.html#a7fc7375ade85917f5ced53fe367dc32b',1,'cv::ParamType< Scalar >::type'],['https://docs.opencv.org/4.2.0/dc/d1c/structcv_1_1ParamType_3_01std_1_1vector_3_01Mat_01_4_01_4.html#aa6210114e54ac35e2477513ecb02ea2a',1,'cv::ParamType< std::vector< Mat > >::type'],['https://docs.opencv.org/4.2.0/d0/d5f/structcv_1_1ParamType_3_01String_01_4.html#a8bbf1a9470dc13d3a3dff28e03a026a1',1,'cv::ParamType< String >::type'],['https://docs.opencv.org/4.2.0/d3/da3/structcv_1_1ParamType_3_01uchar_01_4.html#adf7b7b3ab6eb496d6817b093e4fcb09e',1,'cv::ParamType< uchar >::type'],['https://docs.opencv.org/4.2.0/dc/d63/structcv_1_1ParamType_3_01uint64_01_4.html#a9592ae25ee7b861fe339eb07bd4d10ed',1,'cv::ParamType< uint64 >::type'],['https://docs.opencv.org/4.2.0/d7/d68/structcv_1_1ParamType_3_01unsigned_01_4.html#a4f8b9f217561fdd22bca401c47526b62',1,'cv::ParamType< unsigned >::type'],['https://docs.opencv.org/4.2.0/de/d7d/classcv_1_1dnn_1_1PoolingLayer.html#a0cb63164efd77bbfabd77ff68ea5ce8d',1,'cv::dnn::PoolingLayer::type'],['https://docs.opencv.org/4.2.0/d7/d56/structcv_1_1datasets_1_1SLAM__tumindoorObj.html#a351c8eb553d89b00cb00a6dac0cd2107',1,'cv::datasets::SLAM_tumindoorObj::type'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a1ab7160b93aac1aa5ae015560d6fa5ae',1,'cv::TermCriteria::type'],['https://docs.opencv.org/4.2.0/d7/de9/structcv_1_1Subdiv2D_1_1Vertex.html#a908ed821dcfd03b5cd1de763885537a3',1,'cv::Subdiv2D::Vertex::type']]], + ['type1_115',['type1',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#a32db8f0b08a582326de2ecc1e2baea10',1,'cv::datasets::HPE_humanevaObj']]], + ['type2_116',['type2',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#a6f03ab1a7944ee6a50a81404b8760e77',1,'cv::datasets::HPE_humanevaObj']]], + ['type_5f5_5f8_117',['TYPE_5_8',['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08a16aa140499fc16449dfae5f095dc475c',1,'cv::FastFeatureDetector']]], + ['type_5f7_5f12_118',['TYPE_7_12',['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08af4be71a038c46401a0b431fcc994900d',1,'cv::FastFeatureDetector']]], + ['type_5f9_5f16_119',['TYPE_9_16',['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#a4654f6fb0aa4b8e9123b223bfa0e2a08a7a1af523673c330d43ec47081bcc55e3',1,'cv::FastFeatureDetector']]], + ['type_5faccelerator_120',['TYPE_ACCELERATOR',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2a3e0bdde0459301ccb652c1387997ae07',1,'cv::ocl::Device']]], + ['type_5fall_121',['TYPE_ALL',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2af32644a14837526000cb67fe3331fa10',1,'cv::ocl::Device']]], + ['type_5fcpu_122',['TYPE_CPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2ae3f66c5131806996dd0a77dcc27b5cdb',1,'cv::ocl::Device']]], + ['type_5fdefault_123',['TYPE_DEFAULT',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2a85e501bfc1d0b86cc5a00b3231169594',1,'cv::ocl::Device']]], + ['type_5fdgpu_124',['TYPE_DGPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2ade0b46bcd7730a122fc2db365d46f134',1,'cv::ocl::Device']]], + ['type_5ffun_125',['TYPE_FUN',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a76e4e851a896def5b60f25367f44ac6f',1,'cv::instr']]], + ['type_5fgeneral_126',['TYPE_GENERAL',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a289321828657503ab1539ad17904a925',1,'cv::instr']]], + ['type_5fgpu_127',['TYPE_GPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2aeb33963824886f155640fbcaef41d31f',1,'cv::ocl::Device']]], + ['type_5figpu_128',['TYPE_IGPU',['https://docs.opencv.org/4.2.0/d7/d9f/classcv_1_1ocl_1_1Device.html#ab58aac8e54e5d70ec1847a76122a21f2a5a9bc4ea9b8ef84cd24a3289e4bd2d9d',1,'cv::ocl::Device']]], + ['type_5fmarker_129',['TYPE_MARKER',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a0025497a8b803c1564fa60d01c628247',1,'cv::instr']]], + ['type_5fmask_130',['TYPE_MASK',['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a7367dc60b8963971f3c8f34dc075ebd6',1,'cv::FileNode::TYPE_MASK'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#aa6207c8cf9a3e442f153dc0241aea600a03b3e6a1defa1189b67c9f3d70b7c448',1,'cv::Mat::TYPE_MASK'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a6ecf93c4dac94616b02918ad5b3892d5abb9b861c1d3e39f5d4194c49c44c3c90',1,'cv::gapi::own::detail::MatHeader::TYPE_MASK'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#a253082dc73b6e195968b5cd6ad10c71bacfda75d2f03eb3b2dc71e9654b5bef46',1,'cv::UMat::TYPE_MASK']]], + ['type_5fwrapper_131',['TYPE_WRAPPER',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#ab97cb8c3f3c89d95e1a8a6c090534b07a3bb468f2996912301469d76be784c183',1,'cv::instr']]] ]; diff --git a/search/variables_2.js b/search/variables_2.js index 2e815339..bfd38999 100644 --- a/search/variables_2.js +++ b/search/variables_2.js @@ -92,8 +92,8 @@ var searchData= ['bottomleft_89',['BottomLeft',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a384d9fbe2c6b6b69a8ea7c5632a61f5c',1,'Eigen::AlignedBox']]], ['bottomleftceil_90',['BottomLeftCeil',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a66446e8ccb4fe84bdcebc6d3c1e52a1b',1,'Eigen::AlignedBox']]], ['bottomleftfloor_91',['BottomLeftFloor',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a66786d5e4ba263c9725c3476fc421281',1,'Eigen::AlignedBox']]], - ['bottomright_92',['bottomRight',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#ab3c3970a65dfa0b4e020e101a9fdae7f',1,'cv::Subdiv2D']]], - ['bottomright_93',['BottomRight',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a8eba0291472401f9a777cf571f1b8b8b',1,'Eigen::AlignedBox']]], + ['bottomright_92',['BottomRight',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a8eba0291472401f9a777cf571f1b8b8b',1,'Eigen::AlignedBox']]], + ['bottomright_93',['bottomRight',['https://docs.opencv.org/4.2.0/df/dbf/classcv_1_1Subdiv2D.html#ab3c3970a65dfa0b4e020e101a9fdae7f',1,'cv::Subdiv2D']]], ['bottomrightceil_94',['BottomRightCeil',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a96ff8acc760b61ae37f38b1f63a21306',1,'Eigen::AlignedBox']]], ['bottomrightfloor_95',['BottomRightFloor',['https://eigen.tuxfamily.org/dox/classEigen_1_1AlignedBox.html#ae4aa935b36004fffc49c7a3a85e2d378a5c7a2e5d12782ebf716aff9c1866f50f',1,'Eigen::AlignedBox']]], ['bounding_96',['bounding',['https://docs.opencv.org/4.2.0/df/d90/structcv_1_1datasets_1_1MSM__epflObj.html#afe7012af2bc1cf3542ae212b62951470',1,'cv::datasets::MSM_epflObj']]], diff --git a/search/variables_3.js b/search/variables_3.js index 6645b481..57b78dba 100644 --- a/search/variables_3.js +++ b/search/variables_3.js @@ -1,7 +1,7 @@ var searchData= [ - ['c_0',['c',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5f728e830807710bf3cc18b428057d8e',1,'cv::MatExpr::c'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#a34ee1a0022d3d297d42aca9302d34fbb',1,'cv::ml::DTrees::Split::c'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#a33f73620226c2827824851c0c935b28b',1,'std::queue::c']]], - ['c_1',['C',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3a8eafc49ef685613b37e1b96351fd2bd1',1,'cv::ml::SVM']]], + ['c_0',['C',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3a8eafc49ef685613b37e1b96351fd2bd1',1,'cv::ml::SVM']]], + ['c_1',['c',['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a5f728e830807710bf3cc18b428057d8e',1,'cv::MatExpr::c'],['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1ml_1_1DTrees_1_1Split.html#a34ee1a0022d3d297d42aca9302d34fbb',1,'cv::ml::DTrees::Split::c'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07807.html#a33f73620226c2827824851c0c935b28b',1,'std::queue::c']]], ['c_5fsvc_2',['C_SVC',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa18157ccaec6a252b901cff6de285d608',1,'cv::ml::SVM']]], ['cache_5fall_3',['CACHE_ALL',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a5505fd9ba3f77942517cc1a8ed0fe61dac4a54f32647e1d176076e9b1a4d81e82',1,'cv::rgbd::OdometryFrame']]], ['cache_5fdst_4',['CACHE_DST',['https://docs.opencv.org/4.2.0/d7/d15/structcv_1_1rgbd_1_1OdometryFrame.html#a5505fd9ba3f77942517cc1a8ed0fe61dabd1daa42f6fef759a4be3a20de86c291',1,'cv::rgbd::OdometryFrame']]], @@ -424,8 +424,8 @@ var searchData= ['chain_5fapprox_5ftc89_5fkcos_421',['CHAIN_APPROX_TC89_KCOS',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffa867e7a9ab72c8199a60e2d595d1078a3',1,'cv::CHAIN_APPROX_TC89_KCOS'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffa867e7a9ab72c8199a60e2d595d1078a3',1,'CHAIN_APPROX_TC89_KCOS(Global Namespace)']]], ['chain_5fapprox_5ftc89_5fl1_422',['CHAIN_APPROX_TC89_L1',['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffad29171855734b1cf69fb6653c5d1db35',1,'cv::CHAIN_APPROX_TC89_L1'],['https://docs.opencv.org/4.2.0/d3/dc0/group__imgproc__shape.html#gga4303f45752694956374734a03c54d5ffad29171855734b1cf69fb6653c5d1db35',1,'CHAIN_APPROX_TC89_L1(Global Namespace)']]], ['chan_423',['chan',['https://docs.opencv.org/4.2.0/d0/d82/structcv_1_1GMatDesc.html#a64432cfbe7c973d05e792640f9ddac69',1,'cv::GMatDesc']]], - ['channels_424',['channels',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'cv::Matx::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< _Tp, cn, 1 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 1, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 2, 2 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 2, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 3, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 3, 4 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 4, 4 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, cn, 1 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< float, 2, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< float, 3, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< float, cn, 1 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< float_type, 4, 4 >::channels'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#a431c3759ea478a3fee9f53238b7e7844',1,'cv::cudev::SingleMaskChannels::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'cv::Vec::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< _Tp, 4 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, 2 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, 3 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, 4 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, GPCPatchDescriptor::nFeatures >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, nFeatures >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< float, 2 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< float, 3 >::channels']]], - ['channels_425',['CHANNELS',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baae79bed6b59385fc169be9b668100c852',1,'cv::detail::ExposureCompensator']]], + ['channels_424',['CHANNELS',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baae79bed6b59385fc169be9b668100c852',1,'cv::detail::ExposureCompensator']]], + ['channels_425',['channels',['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'cv::Matx::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< _Tp, cn, 1 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 1, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 2, 2 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 2, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 3, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 3, 4 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, 4, 4 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< double, cn, 1 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< float, 2, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< float, 3, 3 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< float, cn, 1 >::channels'],['https://docs.opencv.org/4.2.0/de/de1/classcv_1_1Matx.html#aa6a8d43b2d8af53824a502ebcd8be3cda9844959a8fb66345ef70c06ec8938f82',1,'Matx< float_type, 4, 4 >::channels'],['https://docs.opencv.org/4.2.0/db/dce/structcv_1_1cudev_1_1SingleMaskChannels.html#a431c3759ea478a3fee9f53238b7e7844',1,'cv::cudev::SingleMaskChannels::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'cv::Vec::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< _Tp, 4 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, 2 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, 3 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, 4 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, GPCPatchDescriptor::nFeatures >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< double, nFeatures >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< float, 2 >::channels'],['https://docs.opencv.org/4.2.0/d6/dcf/classcv_1_1Vec.html#abb63119a7c765b80bf6866b4ba1b880dae9575073c9a06ece6f8f689cfdaffda1',1,'Vec< float, 3 >::channels']]], ['channels_5fblocks_426',['CHANNELS_BLOCKS',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baa3dc8b3fe16858c4c33cb5f928c25af38',1,'cv::detail::ExposureCompensator']]], ['cheb_5fattenuation_427',['cheb_attenuation',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#a0ca99f8e69b5bf6cf7b399dee66aaa6b',1,'cv::TrackerCSRT::Params']]], ['chessboardcorners_428',['chessboardCorners',['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html#a208edcbb778d3095cd5543660f6c4482',1,'cv::aruco::CharucoBoard']]], @@ -460,8 +460,8 @@ var searchData= ['cn_457',['cn',['https://docs.opencv.org/4.2.0/dc/df8/structcv_1_1cudev_1_1VecTraits_3_01char1_01_4.html#ae8807eab22e09639bac1c77010891db0a0887f0bf7575fa61bbb8c219e2931398',1,'cv::cudev::VecTraits< char1 >::cn'],['https://docs.opencv.org/4.2.0/d0/d8d/structcv_1_1cudev_1_1VecTraits_3_01char2_01_4.html#ab397210ae3a1d3ac2aff16b666b2a614a866c28ba41d9eac9ca97dcde8046c4e1',1,'cv::cudev::VecTraits< char2 >::cn'],['https://docs.opencv.org/4.2.0/df/de4/structcv_1_1cudev_1_1VecTraits_3_01char3_01_4.html#a161a54c33544af83c6f93a4e7bbc736ca810ad6828fcbe6917ab982c45a7791ca',1,'cv::cudev::VecTraits< char3 >::cn'],['https://docs.opencv.org/4.2.0/dc/df6/structcv_1_1cudev_1_1VecTraits_3_01char4_01_4.html#a9d82b4027ca3001951a7650501746c49a0c04ed059b66b7582d5fa19df51787e6',1,'cv::cudev::VecTraits< char4 >::cn'],['https://docs.opencv.org/4.2.0/d1/d4e/structcv_1_1cudev_1_1VecTraits_3_01double_01_4.html#a0cc7f0ea115daf0ba3bc859904b6b71fafb865c68bb78e8e4f31a1f95536f6769',1,'cv::cudev::VecTraits< double >::cn'],['https://docs.opencv.org/4.2.0/d1/de1/structcv_1_1cudev_1_1VecTraits_3_01double1_01_4.html#afa9539490e407da9e35220b354e73defa22986735ee0c252c3858220cd9971851',1,'cv::cudev::VecTraits< double1 >::cn'],['https://docs.opencv.org/4.2.0/d6/ded/structcv_1_1cudev_1_1VecTraits_3_01double2_01_4.html#a35d37a9e1d2131d515b04380b0be70e9a59f9c1ac43f38a2427db160aa43c67ee',1,'cv::cudev::VecTraits< double2 >::cn'],['https://docs.opencv.org/4.2.0/d5/d24/structcv_1_1cudev_1_1VecTraits_3_01double3_01_4.html#a82086d4574f4a544fd1ed1354281382aa5aea1f06ec7fb53491ac4d503713df77',1,'cv::cudev::VecTraits< double3 >::cn'],['https://docs.opencv.org/4.2.0/d1/d5d/structcv_1_1cudev_1_1VecTraits_3_01double4_01_4.html#a8f5f97e6409e888cef52d38312fc9c7aa91e28159bc11e937807e3c58f35468b0',1,'cv::cudev::VecTraits< double4 >::cn'],['https://docs.opencv.org/4.2.0/d0/d48/structcv_1_1cudev_1_1VecTraits_3_01float_01_4.html#af3a14a81c356ea7a70cb9ec81f6e1948aa095f47aed4b3c57a477ef3ba11f1b5e',1,'cv::cudev::VecTraits< float >::cn'],['https://docs.opencv.org/4.2.0/dc/d22/structcv_1_1cudev_1_1VecTraits_3_01float1_01_4.html#a7655f9ced40cf11548e0fd1e8bf88b31ad0fd865636e8227ffc131bdece00502d',1,'cv::cudev::VecTraits< float1 >::cn'],['https://docs.opencv.org/4.2.0/d9/dfe/structcv_1_1cudev_1_1VecTraits_3_01float2_01_4.html#a2ed991fac6c5cf3544a4085e5d035b5ba0e23b144bea2bd0bb0a1d6b96f4a77f5',1,'cv::cudev::VecTraits< float2 >::cn'],['https://docs.opencv.org/4.2.0/d9/d1a/structcv_1_1cudev_1_1VecTraits_3_01float3_01_4.html#aebe4e0f9b5f588af37c7ad5daa2c571ba27a095590a714ce9d315768c2d4e86e9',1,'cv::cudev::VecTraits< float3 >::cn'],['https://docs.opencv.org/4.2.0/d9/d9c/structcv_1_1cudev_1_1VecTraits_3_01float4_01_4.html#a652718881ac1ee6fa5539f259fa98167aca12f48fdf94fbbd6cda178f7f823a09',1,'cv::cudev::VecTraits< float4 >::cn'],['https://docs.opencv.org/4.2.0/d7/dc2/structcv_1_1cudev_1_1VecTraits_3_01int1_01_4.html#a44c81cb7c73207f347f44baa1f0ec4deaeb6ca6c0b10d300728108ac09f742666',1,'cv::cudev::VecTraits< int1 >::cn'],['https://docs.opencv.org/4.2.0/de/de4/structcv_1_1cudev_1_1VecTraits_3_01int2_01_4.html#a13a65546037ee5ed83720fbf005316cbadf3e8a47e667f2e0395b5fc9cc9ef02d',1,'cv::cudev::VecTraits< int2 >::cn'],['https://docs.opencv.org/4.2.0/d5/dee/structcv_1_1cudev_1_1VecTraits_3_01int3_01_4.html#aa1d2cc4b6dd8bcd19a9745038bc9404ea0144ac25f8f3eb5c4e4de6093ee892c6',1,'cv::cudev::VecTraits< int3 >::cn'],['https://docs.opencv.org/4.2.0/da/d75/structcv_1_1cudev_1_1VecTraits_3_01int4_01_4.html#a9cb48b9378b44382cea7eaf5aaa7a3bcacdd1f31c8935e718f4748578679382bd',1,'cv::cudev::VecTraits< int4 >::cn'],['https://docs.opencv.org/4.2.0/d4/d43/structcv_1_1cudev_1_1VecTraits_3_01schar_01_4.html#a3731dabc6b26014fff21e0de2c6a0065a0f2717a73449e3809e01f9b0d8a51f31',1,'cv::cudev::VecTraits< schar >::cn'],['https://docs.opencv.org/4.2.0/da/df0/structcv_1_1cudev_1_1VecTraits_3_01short_01_4.html#ac5cf27c7a3b0796552b95d2b69862af7a470b70491c09549908ee51fd788fb515',1,'cv::cudev::VecTraits< short >::cn'],['https://docs.opencv.org/4.2.0/d6/dec/structcv_1_1cudev_1_1VecTraits_3_01short1_01_4.html#ada37eb577efc1a21e21e454e4b330a53a7a61b37c695fe793e436184430f7883c',1,'cv::cudev::VecTraits< short1 >::cn'],['https://docs.opencv.org/4.2.0/dd/d78/structcv_1_1cudev_1_1VecTraits_3_01short2_01_4.html#a8400ebcedc05799a03324705cd1f5ac6afeb13647e349e519b58493a44714780c',1,'cv::cudev::VecTraits< short2 >::cn'],['https://docs.opencv.org/4.2.0/da/d6d/structcv_1_1cudev_1_1VecTraits_3_01short3_01_4.html#a9f522ee86dbc3fc35145b008c484f750a031073946bb24c67a8e78f2bd37a56c5',1,'cv::cudev::VecTraits< short3 >::cn'],['https://docs.opencv.org/4.2.0/d7/d59/structcv_1_1cudev_1_1VecTraits_3_01short4_01_4.html#a4c229c74d9755e4599f64c10293265e8afe34ac324bc5a5caa2673912453d93c5',1,'cv::cudev::VecTraits< short4 >::cn'],['https://docs.opencv.org/4.2.0/df/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar_01_4.html#a64a5f8c02a63702e2e1d83b43b265088a94301d78e8fa0b6cab848635d2a984ef',1,'cv::cudev::VecTraits< uchar >::cn'],['https://docs.opencv.org/4.2.0/db/d87/structcv_1_1cudev_1_1VecTraits_3_01uchar1_01_4.html#aa5034b7de2850b6d6dd28556ba5ba6b2ad8d6a2cfb52b3816ea5ec3777eb8d245',1,'cv::cudev::VecTraits< uchar1 >::cn'],['https://docs.opencv.org/4.2.0/d0/da8/structcv_1_1cudev_1_1VecTraits_3_01uchar2_01_4.html#a93eb29b11470dd42f8f1cc556de33cfcab96c4cf57d01c9bb4cdab43268b932d2',1,'cv::cudev::VecTraits< uchar2 >::cn'],['https://docs.opencv.org/4.2.0/da/d8a/structcv_1_1cudev_1_1VecTraits_3_01uchar3_01_4.html#aab981b0faf5127a0fa4a99d82d8e10f9ad6201eb2813e8de1b9b1c0616f731b25',1,'cv::cudev::VecTraits< uchar3 >::cn'],['https://docs.opencv.org/4.2.0/d4/dc1/structcv_1_1cudev_1_1VecTraits_3_01uchar4_01_4.html#a176d09042450c5513596c0a382aa7683aea90dc6b8d254db8996aa858ea1d0876',1,'cv::cudev::VecTraits< uchar4 >::cn'],['https://docs.opencv.org/4.2.0/de/d87/structcv_1_1cudev_1_1VecTraits_3_01uint_01_4.html#aa8c714090accbd28ff17fac983f2599da4b8df1a1ff6c65a4336b27b0a6a251c7',1,'cv::cudev::VecTraits< uint >::cn'],['https://docs.opencv.org/4.2.0/de/d41/structcv_1_1cudev_1_1VecTraits_3_01uint1_01_4.html#a2bff6b19fef8faf5ec7a8da2abf4d176a6ca4aec6b9dea7ce42752e17110cd801',1,'cv::cudev::VecTraits< uint1 >::cn'],['https://docs.opencv.org/4.2.0/d7/d19/structcv_1_1cudev_1_1VecTraits_3_01uint2_01_4.html#a907682bcd6d2d60d773c4c95ef36de1ba093f1270803a694a481dc581c23c6ff2',1,'cv::cudev::VecTraits< uint2 >::cn'],['https://docs.opencv.org/4.2.0/da/d00/structcv_1_1cudev_1_1VecTraits_3_01uint3_01_4.html#a3478d28c8ff3f145fd3b2c6362b93f65ac044744a2cfee6b05c861777fcda2bd5',1,'cv::cudev::VecTraits< uint3 >::cn'],['https://docs.opencv.org/4.2.0/dc/d7c/structcv_1_1cudev_1_1VecTraits_3_01uint4_01_4.html#a524289c241acd2fab6073ade39930d4aa681edf5831031ffc3a4db4f34c150e26',1,'cv::cudev::VecTraits< uint4 >::cn'],['https://docs.opencv.org/4.2.0/d9/db8/structcv_1_1cudev_1_1VecTraits_3_01ushort_01_4.html#a11daa5946ed173961f2be099de203e09a7d54dde82283ff456c9767ebbeecb530',1,'cv::cudev::VecTraits< ushort >::cn'],['https://docs.opencv.org/4.2.0/da/d76/structcv_1_1cudev_1_1VecTraits_3_01ushort1_01_4.html#a8045ac31178b2d3ee771a91858493140a47f220862dfa62e44fffca1a60e2c28a',1,'cv::cudev::VecTraits< ushort1 >::cn'],['https://docs.opencv.org/4.2.0/d0/d40/structcv_1_1cudev_1_1VecTraits_3_01ushort2_01_4.html#a9772040257ac14a7a62b1bd05ac9065dad67f4094e48fa58f9712e9ef6ffb9b3e',1,'cv::cudev::VecTraits< ushort2 >::cn'],['https://docs.opencv.org/4.2.0/d4/dd7/structcv_1_1cudev_1_1VecTraits_3_01ushort3_01_4.html#ad3382979d7e87b95026f12005017ca07a876e11f1d920b9dcbae74115dffbf5a5',1,'cv::cudev::VecTraits< ushort3 >::cn'],['https://docs.opencv.org/4.2.0/d3/d14/structcv_1_1cudev_1_1VecTraits_3_01ushort4_01_4.html#ad2389b50b0227ab35034175763e33b5ba216d55c9f868f4f21b87de6e64ebc120',1,'cv::cudev::VecTraits< ushort4 >::cn']]], ['code_458',['code',['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#a81405b438c930b556e9c71210d799e2b',1,'cv::Exception::code'],['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#a90f5e8b6d152aa7f1ecf4a5098020c74',1,'cv::viz::KeyboardEvent::code']]], ['codec_459',['codec',['https://docs.opencv.org/4.2.0/d8/db6/structcv_1_1cudacodec_1_1FormatInfo.html#aa43606fe19ccfc8f9bc98a92377fd999',1,'cv::cudacodec::FormatInfo']]], - ['coef_460',['coef',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#ac755378bf8f25e6340d5c0d690d93cb1',1,'cv::optflow::GPCTree::Node']]], - ['coef_461',['COEF',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3ae7112825b482d70cf5f04bc571f86e57',1,'cv::ml::SVM']]], + ['coef_460',['COEF',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3ae7112825b482d70cf5f04bc571f86e57',1,'cv::ml::SVM']]], + ['coef_461',['coef',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#ac755378bf8f25e6340d5c0d690d93cb1',1,'cv::optflow::GPCTree::Node']]], ['coeffobjectsizetotrack_462',['coeffObjectSizeToTrack',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a9687dc16c686bfa924b8f81672f07f5d',1,'cv::DetectionBasedTracker::InnerParameters']]], ['coeffobjectspeedusinginprediction_463',['coeffObjectSpeedUsingInPrediction',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a7967591810eabddc5ecb13f28a45f213',1,'cv::DetectionBasedTracker::InnerParameters']]], ['coefftrackingwindowsize_464',['coeffTrackingWindowSize',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a9fabef7efb531ebe2f0ba9d2ff06a253',1,'cv::DetectionBasedTracker::InnerParameters']]], @@ -771,8 +771,8 @@ var searchData= ['corrwinsizey_768',['corrWinSizeY',['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga793edfcbae69a2fb3222d83b87add541',1,'cv::stereo::PropagationParameters::corrWinSizeY'],['https://docs.opencv.org/4.2.0/dd/d86/group__stereo.html#ga793edfcbae69a2fb3222d83b87add541',1,'corrWinSizeY(Global Namespace)']]], ['cost_5fcolor_769',['COST_COLOR',['https://docs.opencv.org/4.2.0/d0/d03/classcv_1_1detail_1_1GraphCutSeamFinderBase.html#a42953bdb4c8a234670d37c5b5f4386cbafe0d275582723d93a0c576584ea90091',1,'cv::detail::GraphCutSeamFinderBase']]], ['cost_5fcolor_5fgrad_770',['COST_COLOR_GRAD',['https://docs.opencv.org/4.2.0/d0/d03/classcv_1_1detail_1_1GraphCutSeamFinderBase.html#a42953bdb4c8a234670d37c5b5f4386cba4e0af02eed7c3f02976244dc832e0e81',1,'cv::detail::GraphCutSeamFinderBase']]], - ['count_771',['count',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a78e06b7798ab056aba770b6e49c549b4',1,'cv::LineIterator']]], - ['count_772',['COUNT',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57aeb9da694ea67b3ef7d524521b580867d',1,'cv::TermCriteria']]], + ['count_771',['COUNT',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57aeb9da694ea67b3ef7d524521b580867d',1,'cv::TermCriteria']]], + ['count_772',['count',['https://docs.opencv.org/4.2.0/dc/dd2/classcv_1_1LineIterator.html#a78e06b7798ab056aba770b6e49c549b4',1,'cv::LineIterator']]], ['count_5fminimal_5fn_773',['count_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ad8cdfe2324ea2ea32021f2625b2299f1',1,'__gnu_parallel::_Settings']]], ['cout_774',['cout',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aaf93fdf0812752e0e02c501dea1b38f0',1,'std::cout'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01548.html#aaf93fdf0812752e0e02c501dea1b38f0',1,'std::cout']]], ['cov_5fmat_5fdefault_775',['COV_MAT_DEFAULT',['https://docs.opencv.org/4.2.0/d1/dfb/classcv_1_1ml_1_1EM.html#ad993005b665024ea3c067c4cccd4e898a058904bf7cacd90252c8e3499f3abfaa',1,'cv::ml::EM']]], @@ -827,7 +827,7 @@ var searchData= ['cpu_5fvsx_824',['CPU_VSX',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802a950cffa6194f894aef53bad183ad235d',1,]]], ['cpu_5fvsx3_825',['CPU_VSX3',['https://docs.opencv.org/4.2.0/db/de0/group__core__utils.html#gga74405b66c7a701d17cec08a50b8b2802ac74c287e1c17e424150dc91f40ea629f',1,]]], ['crop_826',['CROP',['https://docs.opencv.org/4.2.0/dd/dac/classcv_1_1detail_1_1Timelapser.html#af76d4f81be079787300899fbfaaf92d3af0f3167875e479f3b72c2c2917077b58',1,'cv::detail::Timelapser']]], - ['cross_827',['cross',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac486a777bd8cd6f37ada22cdd8c09f49',1,'cv::datasets::cross'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac486a777bd8cd6f37ada22cdd8c09f49',1,'cross(Global Namespace)']]], + ['cross_827',['cross',['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac486a777bd8cd6f37ada22cdd8c09f49',1,'cross(Global Namespace)'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac486a777bd8cd6f37ada22cdd8c09f49',1,'cv::datasets::cross'],['https://docs.opencv.org/4.2.0/d9/db7/group__datasets__gr.html#gga610754124ced68d1f05760b5948fbb76ac486a777bd8cd6f37ada22cdd8c09f49',1,'cross(Global Namespace)']]], ['crosscheck_828',['crossCheck',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#a4fd61f0e8a770d4a23c47e7f6240c6ba',1,'cv::BFMatcher']]], ['crossings_829',['crossings',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a36855f1539c64327dbef1fed241a8219',1,'cv::text::ERStat']]], ['crosssegmentationthreshold_830',['crossSegmentationThreshold',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#aee99954ef8164f5441dcf10e08121313',1,'cv::optflow::RLOFOpticalFlowParameter']]], diff --git a/search/variables_5.js b/search/variables_5.js index 4f9ad143..6945c1f3 100644 --- a/search/variables_5.js +++ b/search/variables_5.js @@ -24,8 +24,8 @@ var searchData= ['eofbit_21',['eofbit',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_ios< char, _Traits >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_iostream< char >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_istream< char >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_istream< char, _Traits >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_ostream< char >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'basic_ostream< char, _Traits >::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_fstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ifstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ios::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_iostream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_istream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_istringstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ofstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ostream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_ostringstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::basic_stringstream::eofbit'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a806f6f377e4fb4525d19e6d24df3cd62',1,'std::ios_base::eofbit']]], ['epointinoctavex_22',['ePointInOctaveX',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a260a577f6dc5778ef2fc668c5df32eb7',1,'cv::line_descriptor::KeyLine']]], ['epointinoctavey_23',['ePointInOctaveY',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a1f16ffeca01cfc6bfd9cec4c925c4248',1,'cv::line_descriptor::KeyLine']]], - ['eps_24',['eps',['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html#a3b26a5ba0c8fc5f764a754dd8eb2189c',1,'cv::dnn::MVNLayer::eps'],['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#a12a0a87af93c54e5b9dd67aea517d2dd',1,'cv::videostab::RansacParams::eps'],['https://docs.opencv.org/4.2.0/d1/d65/classcv_1_1SimilarRects.html#a033c52ed5aa5b2473c169b9c7056ab05',1,'cv::SimilarRects::eps']]], - ['eps_25',['EPS',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57a857609e73e7028e638d2ea649f3b45d5',1,'cv::TermCriteria']]], + ['eps_24',['EPS',['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#a56fecdc291ccaba8aad27d67ccf72c57a857609e73e7028e638d2ea649f3b45d5',1,'cv::TermCriteria']]], + ['eps_25',['eps',['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html#a3b26a5ba0c8fc5f764a754dd8eb2189c',1,'cv::dnn::MVNLayer::eps'],['https://docs.opencv.org/4.2.0/da/dc7/structcv_1_1videostab_1_1RansacParams.html#a12a0a87af93c54e5b9dd67aea517d2dd',1,'cv::videostab::RansacParams::eps'],['https://docs.opencv.org/4.2.0/d1/d65/classcv_1_1SimilarRects.html#a033c52ed5aa5b2473c169b9c7056ab05',1,'cv::SimilarRects::eps']]], ['eps_5fsvr_26',['EPS_SVR',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fac6fd17721f6a7b5c10f3ae48b78ed944',1,'cv::ml::SVM']]], ['epsilon_27',['epsilon',['https://docs.opencv.org/4.2.0/d4/dd2/classcv_1_1dnn_1_1BatchNormLayer.html#a6c1e22d35ea56e83747ab94d5890f54d',1,'cv::dnn::BatchNormLayer::epsilon'],['https://docs.opencv.org/4.2.0/dc/df8/classcv_1_1dnn_1_1NormalizeBBoxLayer.html#ac1c3a38875be28fbcfe190319bd54cfa',1,'cv::dnn::NormalizeBBoxLayer::epsilon'],['https://docs.opencv.org/4.2.0/d9/d5d/classcv_1_1TermCriteria.html#ad25836c3b6f8feea30dfdcab528e23d1',1,'cv::TermCriteria::epsilon'],['../namespaceutil.html#af941384c3c1746bf015a31daf66829ec',1,'util::epsilon']]], ['erase_5fcan_5fthrow_28',['erase_can_throw',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html#ace925c8be06b3640abb7b6f486290daba04adc70b657d67c81caf60c8722c9ada',1,'__gnu_pbds::container_traits']]], diff --git a/search/variables_6.js b/search/variables_6.js index 316529d9..17acba61 100644 --- a/search/variables_6.js +++ b/search/variables_6.js @@ -38,8 +38,8 @@ var searchData= ['fiducial_5fscore_35',['fiducial_score',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#a63efee372a9c5c42cdfc67f092ccbbba',1,'cv::datasets::FR_adienceObj']]], ['fiducial_5fyaw_5fangle_36',['fiducial_yaw_angle',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#a72ea703d36fa29d577cc97d00139e349',1,'cv::datasets::FR_adienceObj']]], ['file_37',['file',['https://docs.opencv.org/4.2.0/d4/dd9/structcvv_1_1impl_1_1CallMetaData.html#acedbc755e15b5a0d955cbe58108537f4',1,'cvv::impl::CallMetaData::file'],['https://docs.opencv.org/4.2.0/d1/dee/classcv_1_1Exception.html#afef67d957832b1e20e24208a1da57379',1,'cv::Exception::file']]], - ['filename_38',['filename',['https://docs.opencv.org/4.2.0/d0/db6/structcv_1_1datasets_1_1OR__pascalObj.html#a43281c86747b2a116960953662ebd93f',1,'cv::datasets::OR_pascalObj::filename'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1datasets_1_1PD__inriaObj.html#a376d963836cb12a17767969d9b7455b0',1,'cv::datasets::PD_inriaObj::filename']]], - ['filename_39',['fileName',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#add0020a627fead72259285e837069056',1,'cv::datasets::HPE_humanevaObj::fileName'],['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1datasets_1_1TR__icdarObj.html#a9e189665fb29ff90c2be90643a9b19e9',1,'cv::datasets::TR_icdarObj::fileName'],['https://docs.opencv.org/4.2.0/d3/dc5/structcv_1_1datasets_1_1TR__svtObj.html#a303cc5b4a391a455d9e93a7a7da9a869',1,'cv::datasets::TR_svtObj::fileName']]], + ['filename_38',['fileName',['https://docs.opencv.org/4.2.0/d4/da1/structcv_1_1datasets_1_1HPE__humanevaObj.html#add0020a627fead72259285e837069056',1,'cv::datasets::HPE_humanevaObj::fileName'],['https://docs.opencv.org/4.2.0/de/d04/structcv_1_1datasets_1_1TR__icdarObj.html#a9e189665fb29ff90c2be90643a9b19e9',1,'cv::datasets::TR_icdarObj::fileName'],['https://docs.opencv.org/4.2.0/d3/dc5/structcv_1_1datasets_1_1TR__svtObj.html#a303cc5b4a391a455d9e93a7a7da9a869',1,'cv::datasets::TR_svtObj::fileName']]], + ['filename_39',['filename',['https://docs.opencv.org/4.2.0/d0/db6/structcv_1_1datasets_1_1OR__pascalObj.html#a43281c86747b2a116960953662ebd93f',1,'cv::datasets::OR_pascalObj::filename'],['https://docs.opencv.org/4.2.0/db/d88/structcv_1_1datasets_1_1PD__inriaObj.html#a376d963836cb12a17767969d9b7455b0',1,'cv::datasets::PD_inriaObj::filename']]], ['filenameorid_40',['filenameOrID',['../structcam_1_1CameraConfig.html#ab308ad40c78d14a529c86c0365ec9898',1,'cam::CameraConfig']]], ['fill_5fminimal_5fn_41',['fill_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#ae12932b6ecb49293c8c68a0d5dbf8919',1,'__gnu_parallel::_Settings']]], ['filled_42',['FILLED',['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a89c5f6beef080e6df347167f85e07b9e',1,'cv::FILLED'],['https://docs.opencv.org/4.2.0/d6/d6e/group__imgproc__draw.html#ggaf076ef45de481ac96e0ab3dc2c29a777a89c5f6beef080e6df347167f85e07b9e',1,'FILLED(Global Namespace)']]], @@ -64,8 +64,8 @@ var searchData= ['fixed_61',['fixed',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_ios< char, _Traits >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_iostream< char >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_istream< char >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_istream< char, _Traits >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_ostream< char >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'basic_ostream< char, _Traits >::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_fstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ifstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ios::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_iostream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_istream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_istringstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ofstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ostream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_ostringstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::basic_stringstream::fixed'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ab68a9e528eb897d85741f7a21adf4368',1,'std::ios_base::fixed']]], ['fixed_5fsize_62',['FIXED_SIZE',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba4eb3928003c50a19e08aebee36ed3a7e',1,'cv::_InputArray']]], ['fixed_5ftype_63',['FIXED_TYPE',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba517c23e91976c6c72e6cb025fae551aa',1,'cv::_InputArray']]], - ['flags_64',['flags',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#af3be19723301164bb9932133f550149f',1,'cv::_InputArray::flags'],['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#aa0a8079aa21df8ab4d8fd7769eedf79a',1,'cv::BOWKMeansTrainer::flags'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#adfd242b365e79ebc382a0829d8e9f44f',1,'cv::cuda::GpuMat::flags'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#af81a4ce11a420f2905f7666d5545c674',1,'cv::cuda::HostMem::flags'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a6c2adb1ffd71913a3c37ea4f0e0583f5',1,'cv::ocl::KernelArg::flags'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af9333f06c84f115fda4cdf3af18c2ad0',1,'cv::Mat::flags'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a039a50c85f8475f06e3aecb9fb9b0f0c',1,'cv::MatExpr::flags'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a94a639f4af82b43e32307b34b28a8193',1,'cv::gapi::own::detail::MatHeader::flags'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ad5f261bc8c1330e4e516684861410cd2',1,'cv::SparseMat::flags'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ad662d8ae2354913ddee4374cb5a86808',1,'cv::UMat::flags'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#abd20502f4de49d5bf2fe2147d3f49d83',1,'cv::UMatData::flags']]], - ['flags_65',['Flags',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'Eigen::DenseBase::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'DenseBase< ArrayWrapper< ExpressionType > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'DenseBase< Solve< Decomposition, RhsType > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'Eigen::SparseMatrixBase::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< Transpose< MatrixType > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::Flags']]], + ['flags_64',['Flags',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'Eigen::DenseBase::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'DenseBase< ArrayWrapper< ExpressionType > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da7392c9b2ad41ba3c16fdc5306c04d581',1,'DenseBase< Solve< Decomposition, RhsType > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'Eigen::SparseMatrixBase::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< Transpose< MatrixType > >::Flags'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2af043b36fe9e08df0107cf6de496165',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::Flags']]], + ['flags_65',['flags',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#af3be19723301164bb9932133f550149f',1,'cv::_InputArray::flags'],['https://docs.opencv.org/4.2.0/d4/d72/classcv_1_1BOWKMeansTrainer.html#aa0a8079aa21df8ab4d8fd7769eedf79a',1,'cv::BOWKMeansTrainer::flags'],['https://docs.opencv.org/4.2.0/d0/d60/classcv_1_1cuda_1_1GpuMat.html#adfd242b365e79ebc382a0829d8e9f44f',1,'cv::cuda::GpuMat::flags'],['https://docs.opencv.org/4.2.0/d0/d44/classcv_1_1cuda_1_1HostMem.html#af81a4ce11a420f2905f7666d5545c674',1,'cv::cuda::HostMem::flags'],['https://docs.opencv.org/4.2.0/d3/d17/classcv_1_1ocl_1_1KernelArg.html#a6c2adb1ffd71913a3c37ea4f0e0583f5',1,'cv::ocl::KernelArg::flags'],['https://docs.opencv.org/4.2.0/d3/d63/classcv_1_1Mat.html#af9333f06c84f115fda4cdf3af18c2ad0',1,'cv::Mat::flags'],['https://docs.opencv.org/4.2.0/d1/d10/classcv_1_1MatExpr.html#a039a50c85f8475f06e3aecb9fb9b0f0c',1,'cv::MatExpr::flags'],['https://docs.opencv.org/4.2.0/da/d5d/structcv_1_1gapi_1_1own_1_1detail_1_1MatHeader.html#a94a639f4af82b43e32307b34b28a8193',1,'cv::gapi::own::detail::MatHeader::flags'],['https://docs.opencv.org/4.2.0/dd/da9/classcv_1_1SparseMat.html#ad5f261bc8c1330e4e516684861410cd2',1,'cv::SparseMat::flags'],['https://docs.opencv.org/4.2.0/d7/d45/classcv_1_1UMat.html#ad662d8ae2354913ddee4374cb5a86808',1,'cv::UMat::flags'],['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#abd20502f4de49d5bf2fe2147d3f49d83',1,'cv::UMatData::flags']]], ['flags_5fexpand_5fsame_5fnames_66',['FLAGS_EXPAND_SAME_NAMES',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612a0f3b3d3a281bf899e129650268314e8f',1,'cv::instr']]], ['flags_5fmapping_67',['FLAGS_MAPPING',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612a2179656df5cb2d063fc7d4cd7832c674',1,'cv::instr']]], ['flags_5fnone_68',['FLAGS_NONE',['https://docs.opencv.org/4.2.0/dc/d47/namespacecv_1_1instr.html#a017f72a106b21e7ed62c5efa25300612a7cb3d7e2fb9323ea58c26d71b0b5ad41',1,'cv::instr']]], diff --git a/search/variables_7.js b/search/variables_7.js index 0b0c4c7d..e6a6596c 100644 --- a/search/variables_7.js +++ b/search/variables_7.js @@ -1,7 +1,7 @@ var searchData= [ - ['gain_0',['gain',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a077d73eb075b00779dc009a9057c27c3',1,'cv::KalmanFilter']]], - ['gain_1',['GAIN',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baa6ba7b5295c631d353f070e1e471d8cee',1,'cv::detail::ExposureCompensator']]], + ['gain_0',['GAIN',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baa6ba7b5295c631d353f070e1e471d8cee',1,'cv::detail::ExposureCompensator']]], + ['gain_1',['gain',['https://docs.opencv.org/4.2.0/dd/d6a/classcv_1_1KalmanFilter.html#a077d73eb075b00779dc009a9057c27c3',1,'cv::KalmanFilter']]], ['gain_5fblocks_2',['GAIN_BLOCKS',['https://docs.opencv.org/4.2.0/d2/d37/classcv_1_1detail_1_1ExposureCompensator.html#ad3218eb95457927897dd65880727e5baac165e2abfe45df8b7216509597a833e8',1,'cv::detail::ExposureCompensator']]], ['gamma_3',['GAMMA',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3a9b81805a0cd06dc59c354b0ad6fc9e9a',1,'cv::ml::SVM']]], ['gamma_4',['gamma',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#ad81e016e54ee7a22491514d95f91d901',1,'NCVBroxOpticalFlowDescriptor']]], diff --git a/search/variables_8.js b/search/variables_8.js index 4e69a501..a3741d87 100644 --- a/search/variables_8.js +++ b/search/variables_8.js @@ -57,8 +57,8 @@ var searchData= ['hog_5fclip_54',['hog_clip',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#ab3f74654aab04dd1e954a92a09e1c40a',1,'cv::TrackerCSRT::Params']]], ['hog_5forientations_55',['hog_orientations',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#af5cb507efd9c685dd6f2893ca103ca24',1,'cv::TrackerCSRT::Params']]], ['hole_5farea_5fratio_56',['hole_area_ratio',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a00ec10ed2344021eddd593b09e1b857a',1,'cv::text::ERStat']]], - ['horizontal_57',['horizontal',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#ae7297d16cebc75ef79f227730c651cf1',1,'cv::structured_light::SinusoidalPattern::Params']]], - ['horizontal_58',['Horizontal',['https://eigen.tuxfamily.org/dox/group__enums.html#ggad49a7b3738e273eb00932271b36127f7a961c62410157b64033839488f4d7f7e4',1,'Eigen::Horizontal'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggad49a7b3738e273eb00932271b36127f7a961c62410157b64033839488f4d7f7e4',1,'Horizontal(Global Namespace)']]], + ['horizontal_57',['Horizontal',['https://eigen.tuxfamily.org/dox/group__enums.html#ggad49a7b3738e273eb00932271b36127f7a961c62410157b64033839488f4d7f7e4',1,'Eigen::Horizontal'],['https://eigen.tuxfamily.org/dox/group__enums.html#ggad49a7b3738e273eb00932271b36127f7a961c62410157b64033839488f4d7f7e4',1,'Horizontal(Global Namespace)']]], + ['horizontal_58',['horizontal',['https://docs.opencv.org/4.2.0/df/d21/structcv_1_1structured__light_1_1SinusoidalPattern_1_1Params.html#ae7297d16cebc75ef79f227730c651cf1',1,'cv::structured_light::SinusoidalPattern::Params']]], ['horizontalcellsgain_59',['horizontalCellsGain',['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#ab92fe32e98d0a84c0c444b26e7e3c143',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters']]], ['host_5fcopy_5fobsolete_60',['HOST_COPY_OBSOLETE',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4aaeab7d089a219c65db6b6b62bd4d12aa335180c2d069e30096f883702476f96',1,'cv::UMatData']]], ['hough_5fgradient_61',['HOUGH_GRADIENT',['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65ab1bf00a90864db34b2f72fa76389931d',1,'cv::HOUGH_GRADIENT'],['https://docs.opencv.org/4.2.0/dd/d1a/group__imgproc__feature.html#gga073687a5b96ac7a3ab5802eb5510fe65ab1bf00a90864db34b2f72fa76389931d',1,'HOUGH_GRADIENT(Global Namespace)']]], diff --git a/search/variables_9.js b/search/variables_9.js index bb216d88..75b43de8 100644 --- a/search/variables_9.js +++ b/search/variables_9.js @@ -1,7 +1,7 @@ var searchData= [ - ['i_0',['i',['https://docs.opencv.org/4.2.0/dd/d0f/unionCv16suf.html#a99b698f5f5c40c5542c844e595310353',1,'Cv16suf::i'],['https://docs.opencv.org/4.2.0/d9/df3/unionCv32suf.html#a424508ebe407f2e67376ddfca524d16f',1,'Cv32suf::i'],['https://docs.opencv.org/4.2.0/de/d55/unionCv64suf.html#af9bfb67aa19f4eaf8eab3b0ee48784ac',1,'Cv64suf::i'],['https://docs.opencv.org/4.2.0/da/dff/structTHash.html#a925e525d7c839cc562389743c45686d0',1,'THash::i']]], - ['i_1',['I',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a9273ad55d7ee6b78865cc627c59e5890',1,'cv::quality::QualitySSIM::_mat_data']]], + ['i_0',['I',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a9273ad55d7ee6b78865cc627c59e5890',1,'cv::quality::QualitySSIM::_mat_data']]], + ['i_1',['i',['https://docs.opencv.org/4.2.0/dd/d0f/unionCv16suf.html#a99b698f5f5c40c5542c844e595310353',1,'Cv16suf::i'],['https://docs.opencv.org/4.2.0/d9/df3/unionCv32suf.html#a424508ebe407f2e67376ddfca524d16f',1,'Cv32suf::i'],['https://docs.opencv.org/4.2.0/de/d55/unionCv64suf.html#af9bfb67aa19f4eaf8eab3b0ee48784ac',1,'Cv64suf::i'],['https://docs.opencv.org/4.2.0/da/dff/structTHash.html#a925e525d7c839cc562389743c45686d0',1,'THash::i']]], ['i_5f2_2',['I_2',['https://docs.opencv.org/4.2.0/dd/dcb/structcv_1_1quality_1_1QualitySSIM_1_1__mat__data.html#a0e2b01f52b5d8e9b15faf21b3afc0c21',1,'cv::quality::QualitySSIM::_mat_data']]], ['icap_3',['icap',['https://docs.opencv.org/4.2.0/d8/dfe/classcv_1_1VideoCapture.html#ad20c1542d32a3dfef0a083bede8b956a',1,'cv::VideoCapture']]], ['icase_4',['icase',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a21c1f7289167aa3d0a40b24e39a80f00',1,'std::regex_constants']]], @@ -10,8 +10,8 @@ var searchData= ['icpanglethresh_7',['icpAngleThresh',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a51b5e6aebfaabfba5c5aa7c4096b0f1e',1,'cv::dynafu::Params::icpAngleThresh'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a2d64407bbaf8ab2a24cf3bd6ae579329',1,'cv::kinfu::Params::icpAngleThresh']]], ['icpdistthresh_8',['icpDistThresh',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#a812faf37fffed18dbdf03f8e0bca76c3',1,'cv::dynafu::Params::icpDistThresh'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#a5678096cbccaa23da5852965aa252996',1,'cv::kinfu::Params::icpDistThresh']]], ['icpiterations_9',['icpIterations',['https://docs.opencv.org/4.2.0/d3/d5e/structcv_1_1dynafu_1_1Params.html#ac6aa16994f94c8c73b7c9ac8d5ca22ed',1,'cv::dynafu::Params::icpIterations'],['https://docs.opencv.org/4.2.0/de/d81/structcv_1_1kinfu_1_1Params.html#ad644d8f5f6e13bbcb7cbc4e7f3dbe1c6',1,'cv::kinfu::Params::icpIterations']]], - ['id_10',['id',['https://docs.opencv.org/4.2.0/d1/da9/structcv_1_1datasets_1_1AR__hmdbObj.html#ab9e5beef10a2e25808e6c2fe053e5bc5',1,'cv::datasets::AR_hmdbObj::id'],['https://docs.opencv.org/4.2.0/d1/dda/structcv_1_1DetectionBasedTracker_1_1ExtObject.html#ae5e1e82c76d59cbdb2fabf68d1651dd4',1,'cv::DetectionBasedTracker::ExtObject::id'],['https://docs.opencv.org/4.2.0/de/d3f/structcv_1_1datasets_1_1OR__imagenetObj.html#aa0dff410402738924f9afe35ae632b57',1,'cv::datasets::OR_imagenetObj::id'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a9389b8110d67b6f6744689f8541dd328',1,'cv::ppf_match_3d::PoseCluster3D::id'],['https://docs.opencv.org/4.2.0/da/dff/structTHash.html#a31323677edaf6a5e173d84f5c27b4b20',1,'THash::id'],['https://docs.opencv.org/4.2.0/dd/d88/structcv_1_1datasets_1_1TRACK__alovObj.html#af142b8c0e6af19e23b575e2ff4c87320',1,'cv::datasets::TRACK_alovObj::id'],['https://docs.opencv.org/4.2.0/d9/d36/structcv_1_1datasets_1_1TRACK__votObj.html#aed03da34fe11f6bbd75779d8b015a9b3',1,'cv::datasets::TRACK_votObj::id'],['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#adcb303ba903182804bc1f861634a25e1',1,'cv::DetectionBasedTracker::TrackedObject::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ab4a21a6ecff234461ad994da29515d62',1,'std::collate::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ab4a21a6ecff234461ad994da29515d62',1,'std::collate_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#ad9d09c3f3e6b0adc794173ea09adda8b',1,'std::ctype::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aaa75fca18dac7d25648746904feca918',1,'std::ctype< char >::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#ac0eb2ff99c40a189820f9803c63dd088',1,'std::ctype< wchar_t >::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#ad9d09c3f3e6b0adc794173ea09adda8b',1,'std::ctype_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aaa75fca18dac7d25648746904feca918',1,'std::ctype_byname< char >::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#ae38eadfaa98b16a3c80eb033ab26b61e',1,'std::messages::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#ae38eadfaa98b16a3c80eb033ab26b61e',1,'std::messages_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a8ee8d14c2f705adb46d3505008828269',1,'std::money_get::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a2d7912a45d257158197b3ac3a5039d4c',1,'std::money_put::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a317950d8b379f8a1b10105b2bb641f6a',1,'std::moneypunct::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a317950d8b379f8a1b10105b2bb641f6a',1,'std::moneypunct_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a9ba35915bc52e34ce33274bc6c4b3df0',1,'std::num_get::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#acabca6247d4f37a6a82e556da559ebdf',1,'std::num_put::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aa1b5fb7db7f26982b786d4c03fea1367',1,'std::numpunct::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aa1b5fb7db7f26982b786d4c03fea1367',1,'std::numpunct_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a11391168c5b28260580b93009b4c2d23',1,'std::time_get::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a11391168c5b28260580b93009b4c2d23',1,'std::time_get_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#ae2d3eb3e68bdf1e6bf58cb273b41eda4',1,'std::time_put::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#ae2d3eb3e68bdf1e6bf58cb273b41eda4',1,'std::time_put_byname::id']]], - ['id_11',['ID',['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#aeea2d9545d540097a9d13d76ec58af08',1,'cv::rgbd::RgbdFrame']]], + ['id_10',['ID',['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#aeea2d9545d540097a9d13d76ec58af08',1,'cv::rgbd::RgbdFrame']]], + ['id_11',['id',['https://docs.opencv.org/4.2.0/d1/da9/structcv_1_1datasets_1_1AR__hmdbObj.html#ab9e5beef10a2e25808e6c2fe053e5bc5',1,'cv::datasets::AR_hmdbObj::id'],['https://docs.opencv.org/4.2.0/d1/dda/structcv_1_1DetectionBasedTracker_1_1ExtObject.html#ae5e1e82c76d59cbdb2fabf68d1651dd4',1,'cv::DetectionBasedTracker::ExtObject::id'],['https://docs.opencv.org/4.2.0/de/d3f/structcv_1_1datasets_1_1OR__imagenetObj.html#aa0dff410402738924f9afe35ae632b57',1,'cv::datasets::OR_imagenetObj::id'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#a9389b8110d67b6f6744689f8541dd328',1,'cv::ppf_match_3d::PoseCluster3D::id'],['https://docs.opencv.org/4.2.0/da/dff/structTHash.html#a31323677edaf6a5e173d84f5c27b4b20',1,'THash::id'],['https://docs.opencv.org/4.2.0/dd/d88/structcv_1_1datasets_1_1TRACK__alovObj.html#af142b8c0e6af19e23b575e2ff4c87320',1,'cv::datasets::TRACK_alovObj::id'],['https://docs.opencv.org/4.2.0/d9/d36/structcv_1_1datasets_1_1TRACK__votObj.html#aed03da34fe11f6bbd75779d8b015a9b3',1,'cv::datasets::TRACK_votObj::id'],['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#adcb303ba903182804bc1f861634a25e1',1,'cv::DetectionBasedTracker::TrackedObject::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ab4a21a6ecff234461ad994da29515d62',1,'std::collate::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05895.html#ab4a21a6ecff234461ad994da29515d62',1,'std::collate_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#ad9d09c3f3e6b0adc794173ea09adda8b',1,'std::ctype::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aaa75fca18dac7d25648746904feca918',1,'std::ctype< char >::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05927.html#ac0eb2ff99c40a189820f9803c63dd088',1,'std::ctype< wchar_t >::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05919.html#ad9d09c3f3e6b0adc794173ea09adda8b',1,'std::ctype_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05923.html#aaa75fca18dac7d25648746904feca918',1,'std::ctype_byname< char >::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#ae38eadfaa98b16a3c80eb033ab26b61e',1,'std::messages::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06035.html#ae38eadfaa98b16a3c80eb033ab26b61e',1,'std::messages_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06023.html#a8ee8d14c2f705adb46d3505008828269',1,'std::money_get::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06027.html#a2d7912a45d257158197b3ac3a5039d4c',1,'std::money_put::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a317950d8b379f8a1b10105b2bb641f6a',1,'std::moneypunct::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a06015.html#a317950d8b379f8a1b10105b2bb641f6a',1,'std::moneypunct_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05959.html#a9ba35915bc52e34ce33274bc6c4b3df0',1,'std::num_get::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05963.html#acabca6247d4f37a6a82e556da559ebdf',1,'std::num_put::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aa1b5fb7db7f26982b786d4c03fea1367',1,'std::numpunct::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05951.html#aa1b5fb7db7f26982b786d4c03fea1367',1,'std::numpunct_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a11391168c5b28260580b93009b4c2d23',1,'std::time_get::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05987.html#a11391168c5b28260580b93009b4c2d23',1,'std::time_get_byname::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#ae2d3eb3e68bdf1e6bf58cb273b41eda4',1,'std::time_put::id'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05995.html#ae2d3eb3e68bdf1e6bf58cb273b41eda4',1,'std::time_put_byname::id']]], ['identity_12',['IDENTITY',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ade71470ec8814021728f8b31b09773b0a5cafa9aa38d3f60f8238e867a4a98e0a',1,'cv::ml::ANN_MLP']]], ['idr_5fperiod_13',['IDR_Period',['https://docs.opencv.org/4.2.0/d3/db6/structcv_1_1cudacodec_1_1EncoderParams.html#a0d9a4b07b979b14af7d6463451b702b2',1,'cv::cudacodec::EncoderParams']]], ['ids_14',['ids',['https://docs.opencv.org/4.2.0/d4/db2/classcv_1_1aruco_1_1Board.html#a101fa2154784ce5560898763773d6bd4',1,'cv::aruco::Board']]], diff --git a/search/variables_c.js b/search/variables_c.js index 390ee230..97af1321 100644 --- a/search/variables_c.js +++ b/search/variables_c.js @@ -32,8 +32,8 @@ var searchData= ['ldr_5fsize_29',['LDR_SIZE',['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gga2a3c172d2347484dc6c32247aef4e90ba11377cb33f0a607d50cdc65e529529a1',1,'cv::LDR_SIZE'],['https://docs.opencv.org/4.2.0/d6/df5/group__photo__hdr.html#gga2a3c172d2347484dc6c32247aef4e90ba11377cb33f0a607d50cdc65e529529a1',1,'LDR_SIZE(Global Namespace)']]], ['leakyrelu_30',['LEAKYRELU',['https://docs.opencv.org/4.2.0/d0/dce/classcv_1_1ml_1_1ANN__MLP.html#ade71470ec8814021728f8b31b09773b0a193fdf7b38189212e1f7d2584c5ebaf6',1,'cv::ml::ANN_MLP']]], ['learning_5frate_31',['learning_rate',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a2cc1c97c643620cf6386a6be2da711de',1,'cv::face::FacemarkKazemi::Params']]], - ['left_32',['left',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#a8a20954e6e4a878fb0a58fc88eb07b89',1,'cv::optflow::GPCTree::Node::left'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#a26231cbf179cf990d4f3a813ffda2e3b',1,'cv::ml::DTrees::Node::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_ios< char, _Traits >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_iostream< char >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_istream< char >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_istream< char, _Traits >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_ostream< char >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_ostream< char, _Traits >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_fstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ifstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ios::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_iostream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_istream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_istringstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ofstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ostream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ostringstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_stringstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::ios_base::left'],['../structkinematics_1_1gearpos__t.html#ab9f24910ece227927746cb148af727f5',1,'kinematics::gearpos_t::left']]], - ['left_33',['LEFT',['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a69491a271644378beb97b78b33c96c8f',1,'cv::datasets::LEFT'],['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a69491a271644378beb97b78b33c96c8f',1,'LEFT(Global Namespace)']]], + ['left_32',['LEFT',['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a69491a271644378beb97b78b33c96c8f',1,'cv::datasets::LEFT'],['https://docs.opencv.org/4.2.0/dc/dfb/group__datasets__slam.html#gga4d28f23013f06ead1ded84a16d514805a69491a271644378beb97b78b33c96c8f',1,'LEFT(Global Namespace)']]], + ['left_33',['left',['https://docs.opencv.org/4.2.0/d2/d7d/structcv_1_1optflow_1_1GPCTree_1_1Node.html#a8a20954e6e4a878fb0a58fc88eb07b89',1,'cv::optflow::GPCTree::Node::left'],['https://docs.opencv.org/4.2.0/d4/d7d/classcv_1_1ml_1_1DTrees_1_1Node.html#a26231cbf179cf990d4f3a813ffda2e3b',1,'cv::ml::DTrees::Node::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_ios< char, _Traits >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_iostream< char >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_istream< char >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_istream< char, _Traits >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_ostream< char >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'basic_ostream< char, _Traits >::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_fstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ifstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ios::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_iostream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_istream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_istringstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ofstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ostream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_ostringstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::basic_stringstream::left'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#ac3795cde4efbdf63b27ea978f1a2755d',1,'std::ios_base::left'],['../structkinematics_1_1gearpos__t.html#ab9f24910ece227927746cb148af727f5',1,'kinematics::gearpos_t::left']]], ['leftbutton_34',['LeftButton',['https://docs.opencv.org/4.2.0/dc/d3b/classcv_1_1viz_1_1MouseEvent.html#ada240f2528500ad1615e76fb2fd9e2baad19e455b33545d34f237e9f44c8bbd68',1,'cv::viz::MouseEvent']]], ['length_35',['length',['https://docs.opencv.org/4.2.0/de/d06/classcv_1_1tbm_1_1Track.html#aa226ee4c0ef7a7c622d77247fa82ac6f',1,'cv::tbm::Track']]], ['level_36',['level',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#aa7e9fa13d1173ba688b3550f959be364',1,'cv::text::ERStat::level'],['https://docs.opencv.org/4.2.0/d3/d18/structcv_1_1utils_1_1logging_1_1LogTag.html#ab2f82b2f9e4ed222078e35dfc3bfebe4',1,'cv::utils::logging::LogTag::level']]], diff --git a/search/variables_e.js b/search/variables_e.js index 408f5816..11edf220 100644 --- a/search/variables_e.js +++ b/search/variables_e.js @@ -69,8 +69,8 @@ var searchData= ['ncvpipeobjdet_5fvisualizeinplace_66',['NCVPipeObjDet_VisualizeInPlace',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#ggaf38129fd1797a5cfd7d746065784a44fa9f86308f5c07c4dcfdf2fe61aae9ec58',1,]]], ['nearestmarkercorners_67',['nearestMarkerCorners',['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html#ac530b2d00d82940f85124a46369acc4d',1,'cv::aruco::CharucoBoard']]], ['nearestmarkeridx_68',['nearestMarkerIdx',['https://docs.opencv.org/4.2.0/d0/d3c/classcv_1_1aruco_1_1CharucoBoard.html#a0542ea3c5889d1a8b6610ed6c07fb4ad',1,'cv::aruco::CharucoBoard']]], - ['neg_69',['neg',['https://docs.opencv.org/4.2.0/d4/d6a/structcv_1_1optflow_1_1GPCPatchSample.html#ac349003c6aeac96618e985202601e078',1,'cv::optflow::GPCPatchSample']]], - ['neg_70',['NEG',['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba8382530f5229c7220c0b0f2628334019',1,'cv::datasets::NEG'],['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba8382530f5229c7220c0b0f2628334019',1,'NEG(Global Namespace)']]], + ['neg_69',['NEG',['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba8382530f5229c7220c0b0f2628334019',1,'cv::datasets::NEG'],['https://docs.opencv.org/4.2.0/d8/db1/group__datasets__pd.html#gga53cbd80c15fe793bc8d0c87c57629ccba8382530f5229c7220c0b0f2628334019',1,'NEG(Global Namespace)']]], + ['neg_70',['neg',['https://docs.opencv.org/4.2.0/d4/d6a/structcv_1_1optflow_1_1GPCPatchSample.html#ac349003c6aeac96618e985202601e078',1,'cv::optflow::GPCPatchSample']]], ['negative_5fpwm_5fscales_71',['negative_pwm_scales',['../namespacerobot.html#ad5b3523412c0bfd79035091d88e01624',1,'robot']]], ['negativeslope_72',['negativeSlope',['https://docs.opencv.org/4.2.0/dd/df0/classcv_1_1dnn_1_1ReLULayer.html#ae9c6e8dfc1211e6fe6c6f588c607180b',1,'cv::dnn::ReLULayer']]], ['neighborhoodenergy_5fspatialconstant_73',['neighborhoodEnergy_spatialConstant',['https://docs.opencv.org/4.2.0/d9/dbf/structcv_1_1bioinspired_1_1SegmentationParameters.html#a5eabae14552c41782131442c8317ec6c',1,'cv::bioinspired::SegmentationParameters']]], @@ -103,122 +103,121 @@ var searchData= ['nodenelems_100',['nodeNElems',['https://docs.opencv.org/4.2.0/d7/d4e/classcv_1_1FileNodeIterator.html#a6f58d984f262f8ba6d49bec26b44a1ba',1,'cv::FileNodeIterator']]], ['nodes_101',['nodes',['https://docs.opencv.org/4.2.0/d9/d8b/structhashtable__int.html#a95f66a365503d1e45ac4c90b7eca3673',1,'hashtable_int']]], ['nodesize_102',['nodeSize',['https://docs.opencv.org/4.2.0/d4/d8d/structcv_1_1SparseMat_1_1Hdr.html#a7c640b50e79d174311bd058247a9f8e9',1,'cv::SparseMat::Hdr']]], - ['none_103',['none',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a70bef0686be2c1b746e21069f73415b8',1,'std::locale']]], - ['none_104',['NONE',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba7f22b71cc694233d39d400bb0192a30a',1,'cv::_InputArray::NONE'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a1ffa1550fdf90e132df54bf982e694cd',1,'cv::FileNode::NONE'],['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#aaee8f2a3f0f04415acca5f1ada1ce8eda9eef92f7409954282a9692e42a86a5cc',1,'cv::viz::KeyboardEvent::NONE'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1838399ee67c0957c0ae42cabfa99033aa3aa1dfcdc14255c12d84f9a932493b9',1,'cv::ogl::Texture2D::NONE']]], - ['none_105',['none',['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html#gga3bdb11e4d5333d49ecab1e789fcce58eac10123dfa7c5e5311f56bea9cfbfe795',1,'cv::datasets::none'],['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html#gga3bdb11e4d5333d49ecab1e789fcce58eac10123dfa7c5e5311f56bea9cfbfe795',1,'none(Global Namespace)']]], - ['nonmax_5fsuppression_106',['NONMAX_SUPPRESSION',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#aeb231abf4b24747a3e2f6ca4d99132caa2fb1b00216bfc495c99346bc8c11d328',1,'cv::AgastFeatureDetector::NONMAX_SUPPRESSION'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#aadc316b5df92d9e457c9c984f1bab7eea481d00b76bfc41ad8a6dabb17bb9abe0',1,'cv::FastFeatureDetector::NONMAX_SUPPRESSION']]], - ['nopreferredstorageorderbit_107',['NoPreferredStorageOrderBit',['https://eigen.tuxfamily.org/dox/group__flags.html#ga3c186ad80ddcf5e2ed3d7ee31cca1860',1,'Eigen::NoPreferredStorageOrderBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#ga3c186ad80ddcf5e2ed3d7ee31cca1860',1,'NoPreferredStorageOrderBit(Global Namespace)']]], - ['noqrpreconditioner_108',['NoQRPreconditioner',['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56ea2e95bc818f975b19def01e93d240dece',1,'Eigen::NoQRPreconditioner'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56ea2e95bc818f975b19def01e93d240dece',1,'NoQRPreconditioner(Global Namespace)']]], - ['norm_5fhamming_109',['NORM_HAMMING',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa4b063afd04aebb8dd07085a1207da727',1,'cv::NORM_HAMMING'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa4b063afd04aebb8dd07085a1207da727',1,'NORM_HAMMING(Global Namespace)']]], - ['norm_5fhamming2_110',['NORM_HAMMING2',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7fab9cda83e79380cd273c49de8e3231',1,'cv::NORM_HAMMING2'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7fab9cda83e79380cd273c49de8e3231',1,'NORM_HAMMING2(Global Namespace)']]], - ['norm_5finf_111',['NORM_INF',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fad33872d928c74f8a49d1ba06d72aefc3',1,'cv::NORM_INF'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fad33872d928c74f8a49d1ba06d72aefc3',1,'NORM_INF(Global Namespace)']]], - ['norm_5fl1_112',['NORM_L1',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fab55c78ff204a979026c026ea19de65c9',1,'cv::NORM_L1'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fab55c78ff204a979026c026ea19de65c9',1,'NORM_L1(Global Namespace)']]], - ['norm_5fl2_113',['NORM_L2',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7bacbe84d400336a8f26297d8e80e3a2',1,'cv::NORM_L2'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7bacbe84d400336a8f26297d8e80e3a2',1,'NORM_L2(Global Namespace)']]], - ['norm_5fl2sqr_114',['NORM_L2SQR',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fabe948af03c9289b0dd7e663d5c035f5a',1,'cv::NORM_L2SQR'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fabe948af03c9289b0dd7e663d5c035f5a',1,'NORM_L2SQR(Global Namespace)']]], - ['norm_5fminmax_115',['NORM_MINMAX',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa9f0c1c342a18114d47b516a88e29822e',1,'cv::NORM_MINMAX'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa9f0c1c342a18114d47b516a88e29822e',1,'NORM_MINMAX(Global Namespace)']]], - ['norm_5frelative_116',['NORM_RELATIVE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa0a85f9203dcdf3fbc1cca589b6f5df39',1,'cv::NORM_RELATIVE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa0a85f9203dcdf3fbc1cca589b6f5df39',1,'NORM_RELATIVE(Global Namespace)']]], - ['norm_5ftype_5fmask_117',['NORM_TYPE_MASK',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149faaabf1ea549554e2cbdfde2acfcfc5374',1,'cv::NORM_TYPE_MASK'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149faaabf1ea549554e2cbdfde2acfcfc5374',1,'NORM_TYPE_MASK(Global Namespace)']]], - ['normal_118',['NORMAL',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#aa2a27f17a1a30fad4c54c248b77777e0af115eca6e3361cd5ec6cb1887f0aabd3',1,'cv::xfeatures2d::PCTSignatures::NORMAL'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#ae0feca638ad1b7a6656794871700d8d1a85da6d7bc413e10a648f638151129a91',1,'cv::RNG::NORMAL']]], - ['normal_5fclone_119',['NORMAL_CLONE',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca8e6473804ceaa0e8bd0e5828a05235a7',1,'cv::NORMAL_CLONE'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca8e6473804ceaa0e8bd0e5828a05235a7',1,'NORMAL_CLONE(Global Namespace)']]], - ['normaliseoutput_120',['normaliseOutput',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a4396c41915e446d630378aa4bb34a38b',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters::normaliseOutput'],['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#a88025fa1e453fb0262818c638742ff37',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters::normaliseOutput']]], - ['normals_121',['normals',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#afa1bf8f104bc7f0cfefc2bd2e38495f9',1,'cv::viz::Mesh::normals'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#a35770687c412e32902f350d217e94e1b',1,'cv::rgbd::RgbdFrame::normals']]], - ['normalscomputer_122',['normalsComputer',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#ad0363b8e3836257da95f548e26997bb6',1,'cv::rgbd::ICPOdometry::normalsComputer'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a8da046b88ef9b8aaba29827efc40522d',1,'cv::rgbd::RgbdICPOdometry::normalsComputer']]], - ['normbysize_123',['normBySize',['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#acc60d3ba59155867a3f885b0304e8d38',1,'cv::dnn::LRNLayer']]], - ['normconv_5ffilter_124',['NORMCONV_FILTER',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ggaf454b747a111dc9819419b99807ae7acaaab1c1e6dc436a25e1f5506fb6432d4e',1,'cv::NORMCONV_FILTER'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ggaf454b747a111dc9819419b99807ae7acaaab1c1e6dc436a25e1f5506fb6432d4e',1,'NORMCONV_FILTER(Global Namespace)']]], - ['normsigma0_125',['normSigma0',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a904e3883188ebdb89beefe6a4a965fa2',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['normsigma1_126',['normSigma1',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#ac4cff7f10381d5bdf53dd4e914850cee',1,'cv::optflow::RLOFOpticalFlowParameter']]], - ['normsum_127',['normSum',['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#a056af618dd50c4cf5766fd17b4ac9a47',1,'cv::CvHOGEvaluator']]], - ['normtype_128',['normType',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#a613c8ce6b5f9477398ad901fda9c3976',1,'cv::BFMatcher::normType'],['https://docs.opencv.org/4.2.0/d3/d59/structcv_1_1Hamming.html#af8cc9a994e3652df2cde602e3388fbe2',1,'cv::Hamming::normType'],['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1L1.html#ad89d6306fc5aa869cad4331829a81413',1,'cv::L1::normType'],['https://docs.opencv.org/4.2.0/dc/daa/structcv_1_1L2.html#a8e2183229c487c4bee384b5a013272ee',1,'cv::L2::normType'],['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html#af3f11374d301333b1e0cabf6bdb7a72b',1,'cv::SL2::normType']]], - ['normvariance_129',['normVariance',['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html#a5a238be2bd4942ede8ddd14a31f5fc2f',1,'cv::dnn::MVNLayer']]], - ['nosubs_130',['nosubs',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a29777ae2dd2358f4faf29cb604c3fb85',1,'std::regex_constants']]], - ['not_5fdraw_5fsingle_5flines_131',['NOT_DRAW_SINGLE_LINES',['https://docs.opencv.org/4.2.0/d8/d6f/structcv_1_1line__descriptor_1_1DrawLinesMatchesFlags.html#af77f9b45585f16821d7a06ea38909e68a5211a6d6db85969c518dedcfd810a901',1,'cv::line_descriptor::DrawLinesMatchesFlags']]], - ['nplanes_132',['nplanes',['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a94ba374a7e5a004d19060a522893e09d',1,'cv::NAryMatIterator']]], - ['npos_133',['npos',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a73ccdcfb7ba35398105c667960f1f9f8',1,'cv::CvFeatureEvaluator::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a8ae69d8d271de80c7989283cd34a1790',1,'__gnu_cxx::__versa_string::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'__gnu_debug::basic_string::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< _CharT >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< _CharT, _Traits, _Allocator >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< char >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< char, char_traits< char >, _Byte_alloc >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< char_type, _Traits, _Alloc >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< value_type >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'std::basic_string::npos']]], - ['nppst_5fcuda_5fkernel_5fexecution_5ferror_134',['NPPST_CUDA_KERNEL_EXECUTION_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a1485d49bcf34f4c8b9f26c2bae91ddc1',1,]]], - ['nppst_5ferror_135',['NPPST_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a423ee15b09c37f3a321fd0bb21379bb6',1,]]], - ['nppst_5finvalid_5froi_136',['NPPST_INVALID_ROI',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a33d1cdb1e0f69dc1eb4f5fe757794b0d',1,]]], - ['nppst_5finvalid_5fscale_137',['NPPST_INVALID_SCALE',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a5ef8a814660ade7442f3210368053686',1,]]], - ['nppst_5finvalid_5fstep_138',['NPPST_INVALID_STEP',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a313998ae688b9029f142f5bdfcda25e5',1,]]], - ['nppst_5fmem_5falloc_5ferr_139',['NPPST_MEM_ALLOC_ERR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a76678bd4071693de989b0c2b2971743e',1,]]], - ['nppst_5fmem_5finsufficient_5fbuffer_140',['NPPST_MEM_INSUFFICIENT_BUFFER',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725ac54252ecacba9ac29a8c8adf7787b7f4',1,]]], - ['nppst_5fmem_5finternal_5ferror_141',['NPPST_MEM_INTERNAL_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a69e3ac9796227461e2905630ad6152ce',1,]]], - ['nppst_5fmem_5fresidence_5ferror_142',['NPPST_MEM_RESIDENCE_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a89345ff6d17cbc2332c28b0b7f3a76ea',1,]]], - ['nppst_5fmemcpy_5ferror_143',['NPPST_MEMCPY_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a0fe175e4bae1e6c7a4fb220f42ff5e8f',1,]]], - ['nppst_5fmemfree_5ferr_144',['NPPST_MEMFREE_ERR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725af789d1385b3a4255b8c3e9322b21b3e2',1,]]], - ['nppst_5fnull_5fpointer_5ferror_145',['NPPST_NULL_POINTER_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a884e059b099f673fed83fec389b57289',1,]]], - ['nppst_5fsuccess_146',['NPPST_SUCCESS',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a60e77b014292362309dfc3ad536dc902',1,]]], - ['nppst_5ftexture_5fbind_5ferror_147',['NPPST_TEXTURE_BIND_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725aa160fb71a0d8bf914b4c5f6e6dd8f8a8',1,]]], - ['nppstbicubic_148',['nppStBicubic',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga0bfe03940f062d1a975f748a6ce9357da94c62fb3d22fb953e0769fc76b1bada2',1,]]], - ['nppstborderclamp_149',['nppStBorderClamp',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca54290d1cd5b3edc8d08fddf44a7b1d49',1,]]], - ['nppstbordermirror_150',['nppStBorderMirror',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca40998ebdca4e7972fa1649302b6a5793',1,]]], - ['nppstbordernone_151',['nppStBorderNone',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca84b1bfe04b1ff2cf60fcf67746e1eb48',1,]]], - ['nppstborderwrap_152',['nppStBorderWrap',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca00581d73e23c3cfa12ed297ad65342a1',1,]]], - ['nppstsupersample_153',['nppStSupersample',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga0bfe03940f062d1a975f748a6ce9357da712e2f6fc4e4a9d5d34c9cde78418e29',1,]]], - ['nrm_5ffull_154',['NRM_FULL',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151abcce140638cce986270b7d280fbc0cf8',1,'cv::xfeatures2d::DAISY']]], - ['nrm_5fnone_155',['NRM_NONE',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151a7c15db095b13e2ab1e13b292e201d259',1,'cv::xfeatures2d::DAISY']]], - ['nrm_5fpartial_156',['NRM_PARTIAL',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151a228d8972f227e53b7b1ffaddb979f55b',1,'cv::xfeatures2d::DAISY']]], - ['nrm_5fsift_157',['NRM_SIFT',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151a07e3a3513ec8b0d3b333cdb7ba964fca',1,'cv::xfeatures2d::DAISY']]], - ['nstep_158',['nStep',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a6b2b89fd8ad1ef76a08b088a100a1673',1,'NppStInterpolationState']]], - ['nth_5felement_5fminimal_5fn_159',['nth_element_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a34bef940cd171e22210e1c349152aab9',1,'__gnu_parallel::_Settings']]], - ['nu_160',['NU',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3ae0c1409f55f0158101fcc5e07f095605',1,'cv::ml::SVM']]], - ['nu02_161',['nu02',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ad15583ebb8f3b85acfb55442a6b8c533',1,'cv::Moments']]], - ['nu03_162',['nu03',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a1b5f0e8a3df615e6bb16f6cd89b9a646',1,'cv::Moments']]], - ['nu11_163',['nu11',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ade4cfa48ff5d25d8f24c789282163aa5',1,'cv::Moments']]], - ['nu12_164',['nu12',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ad0cdde3c12b9bf65a97da0d2e7e65e98',1,'cv::Moments']]], - ['nu20_165',['nu20',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a60e0eda02ec9ed4646673bd2b6b72545',1,'cv::Moments']]], - ['nu21_166',['nu21',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a429e531e475a2619195c4787c4992a62',1,'cv::Moments']]], - ['nu30_167',['nu30',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a223d272dc5ec3efe401d6dd1c4fb3087',1,'cv::Moments']]], - ['nu_5fsvc_168',['NU_SVC',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa50c44a78c88f3cde09599fba4347134d',1,'cv::ml::SVM']]], - ['nu_5fsvr_169',['NU_SVR',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa5b4b7e4b189d47be1765b3c6b19f6c80',1,'cv::ml::SVM']]], - ['nullopt_170',['nullopt',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html#ga2221e221b29838a39e88d176b5859900',1,]]], - ['num_5ferrs_5fper_5fmeasurement_5f_171',['num_errs_per_measurement_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a316c5f7ee2a86061f1aab7169aa78bac',1,'cv::detail::BundleAdjusterBase']]], - ['num_5ffeatures_172',['num_features',['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a4953b74f4c9c06fbd4fe5419f8b5a546',1,'cv::linemod::ColorGradient::num_features'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a7eaa7bd397f3f797c1ba05eb6c068ca9',1,'cv::linemod::DepthNormal::num_features']]], - ['num_5fhog_5fchannels_5fused_173',['num_hog_channels_used',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#aa96bc7c04e832dd5e5e57fe3270dc40a',1,'cv::TrackerCSRT::Params']]], - ['num_5fimages_5f_174',['num_images_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a195a4414e1e513a21ad1290cafb2c455',1,'cv::detail::BundleAdjusterBase']]], - ['num_5fin_175',['num_in',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#a75f7bf27319d7cc4be75276b2e2ed861',1,'cv::gapi::ie::detail::ParamDesc']]], - ['num_5finflexion_5fpoints_176',['num_inflexion_points',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a2b1f8919722218f49ae86bc00c48721e',1,'cv::text::ERStat']]], - ['num_5finliers_177',['num_inliers',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#a905005225c80c0b865e44508189634b8',1,'cv::detail::MatchesInfo']]], - ['num_5fmatches_5fthresh1_5f_178',['num_matches_thresh1_',['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#a9feea2b5ac622dcacf9eba2f5a27dafd',1,'cv::detail::BestOf2NearestMatcher']]], - ['num_5fmatches_5fthresh2_5f_179',['num_matches_thresh2_',['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#ad1395b7d534b402b215519b6e9ac8bd9',1,'cv::detail::BestOf2NearestMatcher']]], - ['num_5fout_180',['num_out',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#a91fcee8a7d169d5e0785458c7fb8219f',1,'cv::gapi::ie::detail::ParamDesc']]], - ['num_5fparams_5fper_5fcam_5f_181',['num_params_per_cam_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a53a2fe05702415fbf2926179032c727b',1,'cv::detail::BundleAdjusterBase']]], - ['num_5fref_5fpoints_182',['num_ref_points',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a5aa5adb0a18007b213fb09852f24687c',1,'cv::ppf_match_3d::PPF3DDetector']]], - ['num_5fsplit_183',['num_split',['https://docs.opencv.org/4.2.0/de/d61/classcv_1_1dnn_1_1SliceLayer.html#a97107f7a9f903380576952c526f0425c',1,'cv::dnn::SliceLayer']]], - ['num_5ftest_5fcoordinates_184',['num_test_coordinates',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a154ffe1d90e20d6d940900a682ad3875',1,'cv::face::FacemarkKazemi::Params']]], - ['num_5ftest_5fsplits_185',['num_test_splits',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a148be99b10aac689210a4e42e8fa6cd6',1,'cv::face::FacemarkKazemi::Params']]], - ['num_5ftrees_5fper_5fcascade_5flevel_186',['num_trees_per_cascade_level',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#ad26da85380c6dc4a7f3e27934fb174e1',1,'cv::face::FacemarkKazemi::Params']]], - ['number_5fof_5finner_5fiterations_187',['number_of_inner_iterations',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#a4d4ccb8be909ebdecaa392ee27324a9f',1,'NCVBroxOpticalFlowDescriptor']]], - ['number_5fof_5fouter_5fiterations_188',['number_of_outer_iterations',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#a53fdc567ae0d0b5aeb05f8dd8105f518',1,'NCVBroxOpticalFlowDescriptor']]], - ['number_5fof_5fscales_189',['number_of_scales',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#ad08546bf074b482ed819a528e9c4aa8d',1,'cv::TrackerCSRT::Params']]], - ['number_5fof_5fsolver_5fiterations_190',['number_of_solver_iterations',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#aacbc235d882971d08e1e1c52b0e8d200',1,'NCVBroxOpticalFlowDescriptor']]], - ['numclassifierrootnodes_191',['NumClassifierRootNodes',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#ad3a96f77c2a3fd3377d38344970eadb5',1,'HaarClassifierCascadeDescriptor']]], - ['numclassifiers_192',['numClassifiers',['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#af5ca5c19ee7883c7d3a7ada6385dbcfc',1,'cv::TrackerBoosting::Params']]], - ['numclassifiertotalnodes_193',['NumClassifierTotalNodes',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#ac06d944bc6beabe293f6e9ef9b928e82',1,'HaarClassifierCascadeDescriptor']]], - ['numcodecs_194',['NumCodecs',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a53004f410b4576c429f9b82b34d0bc89',1,'cv::cudacodec::NumCodecs'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a53004f410b4576c429f9b82b34d0bc89',1,'NumCodecs(Global Namespace)']]], - ['numdetectedframes_195',['numDetectedFrames',['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#a6dee9fbd7cfda3cd478bf228c4ae4ef5',1,'cv::DetectionBasedTracker::TrackedObject']]], - ['numdimensions_196',['NumDimensions',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'Eigen::DenseBase::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'DenseBase< ArrayWrapper< ExpressionType > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'DenseBase< Solve< Decomposition, RhsType > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'Eigen::SparseMatrixBase::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< Transpose< MatrixType > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::NumDimensions']]], - ['numeric_197',['numeric',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a50c9f58112ca40d3d53b07e1d524228b',1,'std::locale']]], - ['numericalissue_198',['NumericalIssue',['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea1c6e20706575a629b27a105f07f1883b',1,'Eigen::NumericalIssue'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea1c6e20706575a629b27a105f07f1883b',1,'NumericalIssue(Global Namespace)']]], - ['numfeatures_199',['NumFeatures',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#a21bd5b9e52ecfb00ddbec3bd88df65cb',1,'HaarClassifierCascadeDescriptor']]], - ['numfeatures_200',['numFeatures',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a07f6d9031861da09df711cfc5d6d4d5b',1,'cv::CvFeatureEvaluator::numFeatures'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#ab7eb8578a2e582d6acac9db71ab69fcc',1,'cv::CvFeatureParams::numFeatures'],['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html#a540d5f029fbf504751a4ea99f55c9fe5',1,'cv::TrackerFeatureHAAR::Params::numFeatures']]], - ['numformats_201',['NumFormats',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga1887af7daca9ccca0f51f90bc8777280a1ce1da9c8116af9a854e89c357cefd05',1,'cv::cudacodec::NumFormats'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga1887af7daca9ccca0f51f90bc8777280a1ce1da9c8116af9a854e89c357cefd05',1,'NumFormats(Global Namespace)']]], - ['numframes_202',['numFrames',['https://docs.opencv.org/4.2.0/d3/dad/structcv_1_1datasets_1_1GR__chalearnObj.html#a5de85d16d4b55bb7ba094c2cb6d94b15',1,'cv::datasets::GR_chalearnObj']]], - ['numframesnotdetected_203',['numFramesNotDetected',['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#a04b096c1a1a334b1aae3300fb7336d32',1,'cv::DetectionBasedTracker::TrackedObject']]], - ['numiterperscale_5f_204',['numIterPerScale_',['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html#a36d93786fcb2fe4599389ab3aac7e786',1,'cv::reg::MapperPyramid']]], - ['numlastpositionstotrack_205',['numLastPositionsToTrack',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a2a58d6c53d4e525c891ec89a92df436b',1,'cv::DetectionBasedTracker::InnerParameters']]], - ['numlev_5f_206',['numLev_',['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html#a19463232045102b4ff85d05444104c49',1,'cv::reg::MapperPyramid']]], - ['numofoctave_5f_207',['numOfOctave_',['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#a5031b4c8286e96254ff46ca872fe4008',1,'cv::line_descriptor::BinaryDescriptor::Params']]], - ['numofpixels_208',['numOfPixels',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a5ef7fe33dd5d4096e679148c50bdb64e',1,'cv::line_descriptor::KeyLine']]], - ['numoutput_209',['numOutput',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html#af5a8966504dc3dcf40894731fc899b1d',1,'cv::dnn::BaseConvolutionLayer']]], - ['numstages_210',['NumStages',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#a95d5c1f21f7e1474ca8ec409373229d2',1,'HaarClassifierCascadeDescriptor']]], - ['numstepstoshowwithoutdetecting_211',['numStepsToShowWithoutDetecting',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a102b08d61404b141e997e8bd0370d753',1,'cv::DetectionBasedTracker::InnerParameters']]], - ['numstepstotrackwithoutdetectingifobjecthasnotbeenshown_212',['numStepsToTrackWithoutDetectingIfObjectHasNotBeenShown',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#ab606d5b2e44d0f8f06d79ae26fc21906',1,'cv::DetectionBasedTracker::InnerParameters']]], - ['numstepstowaitbeforefirstshow_213',['numStepsToWaitBeforeFirstShow',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a8ab7c8d16dc319344fbe1cd8983e347f',1,'cv::DetectionBasedTracker::InnerParameters']]], - ['numtrackedsteps_214',['numTrackedSteps',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#adb616a0b54da056cc7ee96963bba52e3',1,'cv::DetectionBasedTracker']]], - ['numvotes_215',['numVotes',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#adeedb890c88c752e80f3d36a24ff2d3b',1,'cv::ppf_match_3d::Pose3D::numVotes'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#ac2708187fcdf45ae3ff3df2d54c3f48a',1,'cv::ppf_match_3d::PoseCluster3D::numVotes']]], - ['nv_5fof_5fperf_5flevel_5ffast_216',['NV_OF_PERF_LEVEL_FAST',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883baf286f574f3b4423bca135a6065bc5dc1',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], - ['nv_5fof_5fperf_5flevel_5fmax_217',['NV_OF_PERF_LEVEL_MAX',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883bafd171d2741a73d833599a11fcb5e39a1',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], - ['nv_5fof_5fperf_5flevel_5fmedium_218',['NV_OF_PERF_LEVEL_MEDIUM',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883ba3801f2bcf9bf58936ba8488db067efff',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], - ['nv_5fof_5fperf_5flevel_5fslow_219',['NV_OF_PERF_LEVEL_SLOW',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883babe6c4386a3af6c5ff3dcaa1d57ed1276',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], - ['nv_5fof_5fperf_5flevel_5fundefined_220',['NV_OF_PERF_LEVEL_UNDEFINED',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883ba4320ccbbaea021d136ec50e1212d1ee1',1,'cv::cuda::NvidiaOpticalFlow_1_0']]] + ['none_103',['NONE',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53ba7f22b71cc694233d39d400bb0192a30a',1,'cv::_InputArray::NONE'],['https://docs.opencv.org/4.2.0/de/dd9/classcv_1_1FileNode.html#a7e3620164bdd341ce53b6d4dccb28f45a1ffa1550fdf90e132df54bf982e694cd',1,'cv::FileNode::NONE'],['https://docs.opencv.org/4.2.0/d3/d06/classcv_1_1viz_1_1KeyboardEvent.html#aaee8f2a3f0f04415acca5f1ada1ce8eda9eef92f7409954282a9692e42a86a5cc',1,'cv::viz::KeyboardEvent::NONE'],['https://docs.opencv.org/4.2.0/d5/ddf/classcv_1_1ogl_1_1Texture2D.html#a1838399ee67c0957c0ae42cabfa99033aa3aa1dfcdc14255c12d84f9a932493b9',1,'cv::ogl::Texture2D::NONE']]], + ['none_104',['none',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a70bef0686be2c1b746e21069f73415b8',1,'std::locale::none'],['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html#gga3bdb11e4d5333d49ecab1e789fcce58eac10123dfa7c5e5311f56bea9cfbfe795',1,'cv::datasets::none'],['https://docs.opencv.org/4.2.0/de/d93/group__datasets__fr.html#gga3bdb11e4d5333d49ecab1e789fcce58eac10123dfa7c5e5311f56bea9cfbfe795',1,'none(Global Namespace)']]], + ['nonmax_5fsuppression_105',['NONMAX_SUPPRESSION',['https://docs.opencv.org/4.2.0/d7/d19/classcv_1_1AgastFeatureDetector.html#aeb231abf4b24747a3e2f6ca4d99132caa2fb1b00216bfc495c99346bc8c11d328',1,'cv::AgastFeatureDetector::NONMAX_SUPPRESSION'],['https://docs.opencv.org/4.2.0/df/d74/classcv_1_1FastFeatureDetector.html#aadc316b5df92d9e457c9c984f1bab7eea481d00b76bfc41ad8a6dabb17bb9abe0',1,'cv::FastFeatureDetector::NONMAX_SUPPRESSION']]], + ['nopreferredstorageorderbit_106',['NoPreferredStorageOrderBit',['https://eigen.tuxfamily.org/dox/group__flags.html#ga3c186ad80ddcf5e2ed3d7ee31cca1860',1,'Eigen::NoPreferredStorageOrderBit'],['https://eigen.tuxfamily.org/dox/group__flags.html#ga3c186ad80ddcf5e2ed3d7ee31cca1860',1,'NoPreferredStorageOrderBit(Global Namespace)']]], + ['noqrpreconditioner_107',['NoQRPreconditioner',['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56ea2e95bc818f975b19def01e93d240dece',1,'Eigen::NoQRPreconditioner'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga46eba0d5c621f590b8cf1b53af31d56ea2e95bc818f975b19def01e93d240dece',1,'NoQRPreconditioner(Global Namespace)']]], + ['norm_5fhamming_108',['NORM_HAMMING',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa4b063afd04aebb8dd07085a1207da727',1,'cv::NORM_HAMMING'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa4b063afd04aebb8dd07085a1207da727',1,'NORM_HAMMING(Global Namespace)']]], + ['norm_5fhamming2_109',['NORM_HAMMING2',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7fab9cda83e79380cd273c49de8e3231',1,'cv::NORM_HAMMING2'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7fab9cda83e79380cd273c49de8e3231',1,'NORM_HAMMING2(Global Namespace)']]], + ['norm_5finf_110',['NORM_INF',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fad33872d928c74f8a49d1ba06d72aefc3',1,'cv::NORM_INF'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fad33872d928c74f8a49d1ba06d72aefc3',1,'NORM_INF(Global Namespace)']]], + ['norm_5fl1_111',['NORM_L1',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fab55c78ff204a979026c026ea19de65c9',1,'cv::NORM_L1'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fab55c78ff204a979026c026ea19de65c9',1,'NORM_L1(Global Namespace)']]], + ['norm_5fl2_112',['NORM_L2',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7bacbe84d400336a8f26297d8e80e3a2',1,'cv::NORM_L2'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa7bacbe84d400336a8f26297d8e80e3a2',1,'NORM_L2(Global Namespace)']]], + ['norm_5fl2sqr_113',['NORM_L2SQR',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fabe948af03c9289b0dd7e663d5c035f5a',1,'cv::NORM_L2SQR'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fabe948af03c9289b0dd7e663d5c035f5a',1,'NORM_L2SQR(Global Namespace)']]], + ['norm_5fminmax_114',['NORM_MINMAX',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa9f0c1c342a18114d47b516a88e29822e',1,'cv::NORM_MINMAX'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa9f0c1c342a18114d47b516a88e29822e',1,'NORM_MINMAX(Global Namespace)']]], + ['norm_5frelative_115',['NORM_RELATIVE',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa0a85f9203dcdf3fbc1cca589b6f5df39',1,'cv::NORM_RELATIVE'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149fa0a85f9203dcdf3fbc1cca589b6f5df39',1,'NORM_RELATIVE(Global Namespace)']]], + ['norm_5ftype_5fmask_116',['NORM_TYPE_MASK',['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149faaabf1ea549554e2cbdfde2acfcfc5374',1,'cv::NORM_TYPE_MASK'],['https://docs.opencv.org/4.2.0/d2/de8/group__core__array.html#ggad12cefbcb5291cf958a85b4b67b6149faaabf1ea549554e2cbdfde2acfcfc5374',1,'NORM_TYPE_MASK(Global Namespace)']]], + ['normal_117',['NORMAL',['https://docs.opencv.org/4.2.0/d0/d74/classcv_1_1xfeatures2d_1_1PCTSignatures.html#aa2a27f17a1a30fad4c54c248b77777e0af115eca6e3361cd5ec6cb1887f0aabd3',1,'cv::xfeatures2d::PCTSignatures::NORMAL'],['https://docs.opencv.org/4.2.0/d1/dd6/classcv_1_1RNG.html#ae0feca638ad1b7a6656794871700d8d1a85da6d7bc413e10a648f638151129a91',1,'cv::RNG::NORMAL']]], + ['normal_5fclone_118',['NORMAL_CLONE',['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca8e6473804ceaa0e8bd0e5828a05235a7',1,'cv::NORMAL_CLONE'],['https://docs.opencv.org/4.2.0/df/da0/group__photo__clone.html#gga8002a65f5a3328fbf15df81b842d3c3ca8e6473804ceaa0e8bd0e5828a05235a7',1,'NORMAL_CLONE(Global Namespace)']]], + ['normaliseoutput_119',['normaliseOutput',['https://docs.opencv.org/4.2.0/d9/d93/structcv_1_1bioinspired_1_1RetinaParameters_1_1IplMagnoParameters.html#a4396c41915e446d630378aa4bb34a38b',1,'cv::bioinspired::RetinaParameters::IplMagnoParameters::normaliseOutput'],['https://docs.opencv.org/4.2.0/d0/dc1/structcv_1_1bioinspired_1_1RetinaParameters_1_1OPLandIplParvoParameters.html#a88025fa1e453fb0262818c638742ff37',1,'cv::bioinspired::RetinaParameters::OPLandIplParvoParameters::normaliseOutput']]], + ['normals_120',['normals',['https://docs.opencv.org/4.2.0/dc/d4f/classcv_1_1viz_1_1Mesh.html#afa1bf8f104bc7f0cfefc2bd2e38495f9',1,'cv::viz::Mesh::normals'],['https://docs.opencv.org/4.2.0/d3/d9c/structcv_1_1rgbd_1_1RgbdFrame.html#a35770687c412e32902f350d217e94e1b',1,'cv::rgbd::RgbdFrame::normals']]], + ['normalscomputer_121',['normalsComputer',['https://docs.opencv.org/4.2.0/d7/d83/classcv_1_1rgbd_1_1ICPOdometry.html#ad0363b8e3836257da95f548e26997bb6',1,'cv::rgbd::ICPOdometry::normalsComputer'],['https://docs.opencv.org/4.2.0/d2/d0f/classcv_1_1rgbd_1_1RgbdICPOdometry.html#a8da046b88ef9b8aaba29827efc40522d',1,'cv::rgbd::RgbdICPOdometry::normalsComputer']]], + ['normbysize_122',['normBySize',['https://docs.opencv.org/4.2.0/d8/d8d/classcv_1_1dnn_1_1LRNLayer.html#acc60d3ba59155867a3f885b0304e8d38',1,'cv::dnn::LRNLayer']]], + ['normconv_5ffilter_123',['NORMCONV_FILTER',['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ggaf454b747a111dc9819419b99807ae7acaaab1c1e6dc436a25e1f5506fb6432d4e',1,'cv::NORMCONV_FILTER'],['https://docs.opencv.org/4.2.0/df/dac/group__photo__render.html#ggaf454b747a111dc9819419b99807ae7acaaab1c1e6dc436a25e1f5506fb6432d4e',1,'NORMCONV_FILTER(Global Namespace)']]], + ['normsigma0_124',['normSigma0',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#a904e3883188ebdb89beefe6a4a965fa2',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['normsigma1_125',['normSigma1',['https://docs.opencv.org/4.2.0/d4/d91/classcv_1_1optflow_1_1RLOFOpticalFlowParameter.html#ac4cff7f10381d5bdf53dd4e914850cee',1,'cv::optflow::RLOFOpticalFlowParameter']]], + ['normsum_126',['normSum',['https://docs.opencv.org/4.2.0/d2/dd9/classcv_1_1CvHOGEvaluator.html#a056af618dd50c4cf5766fd17b4ac9a47',1,'cv::CvHOGEvaluator']]], + ['normtype_127',['normType',['https://docs.opencv.org/4.2.0/d3/da1/classcv_1_1BFMatcher.html#a613c8ce6b5f9477398ad901fda9c3976',1,'cv::BFMatcher::normType'],['https://docs.opencv.org/4.2.0/d3/d59/structcv_1_1Hamming.html#af8cc9a994e3652df2cde602e3388fbe2',1,'cv::Hamming::normType'],['https://docs.opencv.org/4.2.0/d4/d7f/structcv_1_1L1.html#ad89d6306fc5aa869cad4331829a81413',1,'cv::L1::normType'],['https://docs.opencv.org/4.2.0/dc/daa/structcv_1_1L2.html#a8e2183229c487c4bee384b5a013272ee',1,'cv::L2::normType'],['https://docs.opencv.org/4.2.0/d5/d46/structcv_1_1SL2.html#af3f11374d301333b1e0cabf6bdb7a72b',1,'cv::SL2::normType']]], + ['normvariance_128',['normVariance',['https://docs.opencv.org/4.2.0/d4/db5/classcv_1_1dnn_1_1MVNLayer.html#a5a238be2bd4942ede8ddd14a31f5fc2f',1,'cv::dnn::MVNLayer']]], + ['nosubs_129',['nosubs',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a29777ae2dd2358f4faf29cb604c3fb85',1,'std::regex_constants']]], + ['not_5fdraw_5fsingle_5flines_130',['NOT_DRAW_SINGLE_LINES',['https://docs.opencv.org/4.2.0/d8/d6f/structcv_1_1line__descriptor_1_1DrawLinesMatchesFlags.html#af77f9b45585f16821d7a06ea38909e68a5211a6d6db85969c518dedcfd810a901',1,'cv::line_descriptor::DrawLinesMatchesFlags']]], + ['nplanes_131',['nplanes',['https://docs.opencv.org/4.2.0/d5/dd2/classcv_1_1NAryMatIterator.html#a94ba374a7e5a004d19060a522893e09d',1,'cv::NAryMatIterator']]], + ['npos_132',['npos',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a73ccdcfb7ba35398105c667960f1f9f8',1,'cv::CvFeatureEvaluator::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11071.html#a8ae69d8d271de80c7989283cd34a1790',1,'__gnu_cxx::__versa_string::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'__gnu_debug::basic_string::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< _CharT >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< _CharT, _Traits, _Allocator >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< _Elem, char_traits< _Elem >, _Wide_alloc >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< char >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< char, char_traits< char >, _Byte_alloc >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< char_type, _Traits, _Alloc >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'basic_string< value_type >::npos'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a04831.html#ac73924a70ab202e90e1c18c2dea125c9',1,'std::basic_string::npos']]], + ['nppst_5fcuda_5fkernel_5fexecution_5ferror_133',['NPPST_CUDA_KERNEL_EXECUTION_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a1485d49bcf34f4c8b9f26c2bae91ddc1',1,]]], + ['nppst_5ferror_134',['NPPST_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a423ee15b09c37f3a321fd0bb21379bb6',1,]]], + ['nppst_5finvalid_5froi_135',['NPPST_INVALID_ROI',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a33d1cdb1e0f69dc1eb4f5fe757794b0d',1,]]], + ['nppst_5finvalid_5fscale_136',['NPPST_INVALID_SCALE',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a5ef8a814660ade7442f3210368053686',1,]]], + ['nppst_5finvalid_5fstep_137',['NPPST_INVALID_STEP',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a313998ae688b9029f142f5bdfcda25e5',1,]]], + ['nppst_5fmem_5falloc_5ferr_138',['NPPST_MEM_ALLOC_ERR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a76678bd4071693de989b0c2b2971743e',1,]]], + ['nppst_5fmem_5finsufficient_5fbuffer_139',['NPPST_MEM_INSUFFICIENT_BUFFER',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725ac54252ecacba9ac29a8c8adf7787b7f4',1,]]], + ['nppst_5fmem_5finternal_5ferror_140',['NPPST_MEM_INTERNAL_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a69e3ac9796227461e2905630ad6152ce',1,]]], + ['nppst_5fmem_5fresidence_5ferror_141',['NPPST_MEM_RESIDENCE_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a89345ff6d17cbc2332c28b0b7f3a76ea',1,]]], + ['nppst_5fmemcpy_5ferror_142',['NPPST_MEMCPY_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a0fe175e4bae1e6c7a4fb220f42ff5e8f',1,]]], + ['nppst_5fmemfree_5ferr_143',['NPPST_MEMFREE_ERR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725af789d1385b3a4255b8c3e9322b21b3e2',1,]]], + ['nppst_5fnull_5fpointer_5ferror_144',['NPPST_NULL_POINTER_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a884e059b099f673fed83fec389b57289',1,]]], + ['nppst_5fsuccess_145',['NPPST_SUCCESS',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725a60e77b014292362309dfc3ad536dc902',1,]]], + ['nppst_5ftexture_5fbind_5ferror_146',['NPPST_TEXTURE_BIND_ERROR',['https://docs.opencv.org/4.2.0/d5/dc3/group__cudalegacy.html#gga1e06e534e565b0e44afdf96c77951725aa160fb71a0d8bf914b4c5f6e6dd8f8a8',1,]]], + ['nppstbicubic_147',['nppStBicubic',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga0bfe03940f062d1a975f748a6ce9357da94c62fb3d22fb953e0769fc76b1bada2',1,]]], + ['nppstborderclamp_148',['nppStBorderClamp',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca54290d1cd5b3edc8d08fddf44a7b1d49',1,]]], + ['nppstbordermirror_149',['nppStBorderMirror',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca40998ebdca4e7972fa1649302b6a5793',1,]]], + ['nppstbordernone_150',['nppStBorderNone',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca84b1bfe04b1ff2cf60fcf67746e1eb48',1,]]], + ['nppstborderwrap_151',['nppStBorderWrap',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga8b115979ee872d8e356c2f1f162d483ca00581d73e23c3cfa12ed297ad65342a1',1,]]], + ['nppstsupersample_152',['nppStSupersample',['https://docs.opencv.org/4.2.0/d1/d0d/group__nppi.html#gga0bfe03940f062d1a975f748a6ce9357da712e2f6fc4e4a9d5d34c9cde78418e29',1,]]], + ['nrm_5ffull_153',['NRM_FULL',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151abcce140638cce986270b7d280fbc0cf8',1,'cv::xfeatures2d::DAISY']]], + ['nrm_5fnone_154',['NRM_NONE',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151a7c15db095b13e2ab1e13b292e201d259',1,'cv::xfeatures2d::DAISY']]], + ['nrm_5fpartial_155',['NRM_PARTIAL',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151a228d8972f227e53b7b1ffaddb979f55b',1,'cv::xfeatures2d::DAISY']]], + ['nrm_5fsift_156',['NRM_SIFT',['https://docs.opencv.org/4.2.0/d9/d37/classcv_1_1xfeatures2d_1_1DAISY.html#aaf3a347b21a1fd2eeb0b56cce5276151a07e3a3513ec8b0d3b333cdb7ba964fca',1,'cv::xfeatures2d::DAISY']]], + ['nstep_157',['nStep',['https://docs.opencv.org/4.2.0/da/da9/structNppStInterpolationState.html#a6b2b89fd8ad1ef76a08b088a100a1673',1,'NppStInterpolationState']]], + ['nth_5felement_5fminimal_5fn_158',['nth_element_minimal_n',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a09699.html#a34bef940cd171e22210e1c349152aab9',1,'__gnu_parallel::_Settings']]], + ['nu_159',['NU',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#a32d2e8d21aaa4f58cdf9c27c102becf3ae0c1409f55f0158101fcc5e07f095605',1,'cv::ml::SVM']]], + ['nu02_160',['nu02',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ad15583ebb8f3b85acfb55442a6b8c533',1,'cv::Moments']]], + ['nu03_161',['nu03',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a1b5f0e8a3df615e6bb16f6cd89b9a646',1,'cv::Moments']]], + ['nu11_162',['nu11',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ade4cfa48ff5d25d8f24c789282163aa5',1,'cv::Moments']]], + ['nu12_163',['nu12',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#ad0cdde3c12b9bf65a97da0d2e7e65e98',1,'cv::Moments']]], + ['nu20_164',['nu20',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a60e0eda02ec9ed4646673bd2b6b72545',1,'cv::Moments']]], + ['nu21_165',['nu21',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a429e531e475a2619195c4787c4992a62',1,'cv::Moments']]], + ['nu30_166',['nu30',['https://docs.opencv.org/4.2.0/d8/d23/classcv_1_1Moments.html#a223d272dc5ec3efe401d6dd1c4fb3087',1,'cv::Moments']]], + ['nu_5fsvc_167',['NU_SVC',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa50c44a78c88f3cde09599fba4347134d',1,'cv::ml::SVM']]], + ['nu_5fsvr_168',['NU_SVR',['https://docs.opencv.org/4.2.0/d1/d2d/classcv_1_1ml_1_1SVM.html#ab4b93a4c42bbe213ffd9fb3832c6c44fa5b4b7e4b189d47be1765b3c6b19f6c80',1,'cv::ml::SVM']]], + ['nullopt_169',['nullopt',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01525.html#ga2221e221b29838a39e88d176b5859900',1,]]], + ['num_5ferrs_5fper_5fmeasurement_5f_170',['num_errs_per_measurement_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a316c5f7ee2a86061f1aab7169aa78bac',1,'cv::detail::BundleAdjusterBase']]], + ['num_5ffeatures_171',['num_features',['https://docs.opencv.org/4.2.0/dc/d64/classcv_1_1linemod_1_1ColorGradient.html#a4953b74f4c9c06fbd4fe5419f8b5a546',1,'cv::linemod::ColorGradient::num_features'],['https://docs.opencv.org/4.2.0/d7/d47/classcv_1_1linemod_1_1DepthNormal.html#a7eaa7bd397f3f797c1ba05eb6c068ca9',1,'cv::linemod::DepthNormal::num_features']]], + ['num_5fhog_5fchannels_5fused_172',['num_hog_channels_used',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#aa96bc7c04e832dd5e5e57fe3270dc40a',1,'cv::TrackerCSRT::Params']]], + ['num_5fimages_5f_173',['num_images_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a195a4414e1e513a21ad1290cafb2c455',1,'cv::detail::BundleAdjusterBase']]], + ['num_5fin_174',['num_in',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#a75f7bf27319d7cc4be75276b2e2ed861',1,'cv::gapi::ie::detail::ParamDesc']]], + ['num_5finflexion_5fpoints_175',['num_inflexion_points',['https://docs.opencv.org/4.2.0/db/d20/structcv_1_1text_1_1ERStat.html#a2b1f8919722218f49ae86bc00c48721e',1,'cv::text::ERStat']]], + ['num_5finliers_176',['num_inliers',['https://docs.opencv.org/4.2.0/d2/d9a/structcv_1_1detail_1_1MatchesInfo.html#a905005225c80c0b865e44508189634b8',1,'cv::detail::MatchesInfo']]], + ['num_5fmatches_5fthresh1_5f_177',['num_matches_thresh1_',['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#a9feea2b5ac622dcacf9eba2f5a27dafd',1,'cv::detail::BestOf2NearestMatcher']]], + ['num_5fmatches_5fthresh2_5f_178',['num_matches_thresh2_',['https://docs.opencv.org/4.2.0/d4/d26/classcv_1_1detail_1_1BestOf2NearestMatcher.html#ad1395b7d534b402b215519b6e9ac8bd9',1,'cv::detail::BestOf2NearestMatcher']]], + ['num_5fout_179',['num_out',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#a91fcee8a7d169d5e0785458c7fb8219f',1,'cv::gapi::ie::detail::ParamDesc']]], + ['num_5fparams_5fper_5fcam_5f_180',['num_params_per_cam_',['https://docs.opencv.org/4.2.0/d5/d56/classcv_1_1detail_1_1BundleAdjusterBase.html#a53a2fe05702415fbf2926179032c727b',1,'cv::detail::BundleAdjusterBase']]], + ['num_5fref_5fpoints_181',['num_ref_points',['https://docs.opencv.org/4.2.0/db/d25/classcv_1_1ppf__match__3d_1_1PPF3DDetector.html#a5aa5adb0a18007b213fb09852f24687c',1,'cv::ppf_match_3d::PPF3DDetector']]], + ['num_5fsplit_182',['num_split',['https://docs.opencv.org/4.2.0/de/d61/classcv_1_1dnn_1_1SliceLayer.html#a97107f7a9f903380576952c526f0425c',1,'cv::dnn::SliceLayer']]], + ['num_5ftest_5fcoordinates_183',['num_test_coordinates',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a154ffe1d90e20d6d940900a682ad3875',1,'cv::face::FacemarkKazemi::Params']]], + ['num_5ftest_5fsplits_184',['num_test_splits',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#a148be99b10aac689210a4e42e8fa6cd6',1,'cv::face::FacemarkKazemi::Params']]], + ['num_5ftrees_5fper_5fcascade_5flevel_185',['num_trees_per_cascade_level',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#ad26da85380c6dc4a7f3e27934fb174e1',1,'cv::face::FacemarkKazemi::Params']]], + ['number_5fof_5finner_5fiterations_186',['number_of_inner_iterations',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#a4d4ccb8be909ebdecaa392ee27324a9f',1,'NCVBroxOpticalFlowDescriptor']]], + ['number_5fof_5fouter_5fiterations_187',['number_of_outer_iterations',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#a53fdc567ae0d0b5aeb05f8dd8105f518',1,'NCVBroxOpticalFlowDescriptor']]], + ['number_5fof_5fscales_188',['number_of_scales',['https://docs.opencv.org/4.2.0/d3/de9/structcv_1_1TrackerCSRT_1_1Params.html#ad08546bf074b482ed819a528e9c4aa8d',1,'cv::TrackerCSRT::Params']]], + ['number_5fof_5fsolver_5fiterations_189',['number_of_solver_iterations',['https://docs.opencv.org/4.2.0/db/d7a/structNCVBroxOpticalFlowDescriptor.html#aacbc235d882971d08e1e1c52b0e8d200',1,'NCVBroxOpticalFlowDescriptor']]], + ['numclassifierrootnodes_190',['NumClassifierRootNodes',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#ad3a96f77c2a3fd3377d38344970eadb5',1,'HaarClassifierCascadeDescriptor']]], + ['numclassifiers_191',['numClassifiers',['https://docs.opencv.org/4.2.0/dc/daf/structcv_1_1TrackerBoosting_1_1Params.html#af5ca5c19ee7883c7d3a7ada6385dbcfc',1,'cv::TrackerBoosting::Params']]], + ['numclassifiertotalnodes_192',['NumClassifierTotalNodes',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#ac06d944bc6beabe293f6e9ef9b928e82',1,'HaarClassifierCascadeDescriptor']]], + ['numcodecs_193',['NumCodecs',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a53004f410b4576c429f9b82b34d0bc89',1,'cv::cudacodec::NumCodecs'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga71943a1181287609b5d649f53ce6c146a53004f410b4576c429f9b82b34d0bc89',1,'NumCodecs(Global Namespace)']]], + ['numdetectedframes_194',['numDetectedFrames',['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#a6dee9fbd7cfda3cd478bf228c4ae4ef5',1,'cv::DetectionBasedTracker::TrackedObject']]], + ['numdimensions_195',['NumDimensions',['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'Eigen::DenseBase::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'DenseBase< ArrayWrapper< ExpressionType > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'DenseBase< Homogeneous< MatrixType, _Direction > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1DenseBase.html#a0632b818dc6bddab3ed1dd0ff4ec4e5da4d4548a01ba37a6c2031a3c1f0a37d34',1,'DenseBase< Solve< Decomposition, RhsType > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'Eigen::SparseMatrixBase::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, InnerPanel > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< Block< XprType, BlockRows, BlockCols, true > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< CwiseBinaryOp< BinaryOp, Lhs, Rhs > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< Transpose< MatrixType > >::NumDimensions'],['https://eigen.tuxfamily.org/dox/classEigen_1_1SparseMatrixBase.html#aa88dfb83ca810037cf83fb44efaea4f1a2366131ffcc38bff48a1c7572eb86dd3',1,'SparseMatrixBase< TriangularView< MatrixType, Mode > >::NumDimensions']]], + ['numeric_196',['numeric',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05879.html#a50c9f58112ca40d3d53b07e1d524228b',1,'std::locale']]], + ['numericalissue_197',['NumericalIssue',['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea1c6e20706575a629b27a105f07f1883b',1,'Eigen::NumericalIssue'],['https://eigen.tuxfamily.org/dox/group__enums.html#gga85fad7b87587764e5cf6b513a9e0ee5ea1c6e20706575a629b27a105f07f1883b',1,'NumericalIssue(Global Namespace)']]], + ['numfeatures_198',['NumFeatures',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#a21bd5b9e52ecfb00ddbec3bd88df65cb',1,'HaarClassifierCascadeDescriptor']]], + ['numfeatures_199',['numFeatures',['https://docs.opencv.org/4.2.0/d0/d0b/classcv_1_1CvFeatureEvaluator.html#a07f6d9031861da09df711cfc5d6d4d5b',1,'cv::CvFeatureEvaluator::numFeatures'],['https://docs.opencv.org/4.2.0/db/dfc/classcv_1_1CvFeatureParams.html#ab7eb8578a2e582d6acac9db71ab69fcc',1,'cv::CvFeatureParams::numFeatures'],['https://docs.opencv.org/4.2.0/d1/d00/structcv_1_1TrackerFeatureHAAR_1_1Params.html#a540d5f029fbf504751a4ea99f55c9fe5',1,'cv::TrackerFeatureHAAR::Params::numFeatures']]], + ['numformats_200',['NumFormats',['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga1887af7daca9ccca0f51f90bc8777280a1ce1da9c8116af9a854e89c357cefd05',1,'cv::cudacodec::NumFormats'],['https://docs.opencv.org/4.2.0/d0/d61/group__cudacodec.html#gga1887af7daca9ccca0f51f90bc8777280a1ce1da9c8116af9a854e89c357cefd05',1,'NumFormats(Global Namespace)']]], + ['numframes_201',['numFrames',['https://docs.opencv.org/4.2.0/d3/dad/structcv_1_1datasets_1_1GR__chalearnObj.html#a5de85d16d4b55bb7ba094c2cb6d94b15',1,'cv::datasets::GR_chalearnObj']]], + ['numframesnotdetected_202',['numFramesNotDetected',['https://docs.opencv.org/4.2.0/dc/de0/structcv_1_1DetectionBasedTracker_1_1TrackedObject.html#a04b096c1a1a334b1aae3300fb7336d32',1,'cv::DetectionBasedTracker::TrackedObject']]], + ['numiterperscale_5f_203',['numIterPerScale_',['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html#a36d93786fcb2fe4599389ab3aac7e786',1,'cv::reg::MapperPyramid']]], + ['numlastpositionstotrack_204',['numLastPositionsToTrack',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a2a58d6c53d4e525c891ec89a92df436b',1,'cv::DetectionBasedTracker::InnerParameters']]], + ['numlev_5f_205',['numLev_',['https://docs.opencv.org/4.2.0/db/d6a/classcv_1_1reg_1_1MapperPyramid.html#a19463232045102b4ff85d05444104c49',1,'cv::reg::MapperPyramid']]], + ['numofoctave_5f_206',['numOfOctave_',['https://docs.opencv.org/4.2.0/d9/d85/structcv_1_1line__descriptor_1_1BinaryDescriptor_1_1Params.html#a5031b4c8286e96254ff46ca872fe4008',1,'cv::line_descriptor::BinaryDescriptor::Params']]], + ['numofpixels_207',['numOfPixels',['https://docs.opencv.org/4.2.0/d1/dd7/structcv_1_1line__descriptor_1_1KeyLine.html#a5ef7fe33dd5d4096e679148c50bdb64e',1,'cv::line_descriptor::KeyLine']]], + ['numoutput_208',['numOutput',['https://docs.opencv.org/4.2.0/d5/d1f/classcv_1_1dnn_1_1BaseConvolutionLayer.html#af5a8966504dc3dcf40894731fc899b1d',1,'cv::dnn::BaseConvolutionLayer']]], + ['numstages_209',['NumStages',['https://docs.opencv.org/4.2.0/d6/dfc/structHaarClassifierCascadeDescriptor.html#a95d5c1f21f7e1474ca8ec409373229d2',1,'HaarClassifierCascadeDescriptor']]], + ['numstepstoshowwithoutdetecting_210',['numStepsToShowWithoutDetecting',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a102b08d61404b141e997e8bd0370d753',1,'cv::DetectionBasedTracker::InnerParameters']]], + ['numstepstotrackwithoutdetectingifobjecthasnotbeenshown_211',['numStepsToTrackWithoutDetectingIfObjectHasNotBeenShown',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#ab606d5b2e44d0f8f06d79ae26fc21906',1,'cv::DetectionBasedTracker::InnerParameters']]], + ['numstepstowaitbeforefirstshow_212',['numStepsToWaitBeforeFirstShow',['https://docs.opencv.org/4.2.0/d9/d44/structcv_1_1DetectionBasedTracker_1_1InnerParameters.html#a8ab7c8d16dc319344fbe1cd8983e347f',1,'cv::DetectionBasedTracker::InnerParameters']]], + ['numtrackedsteps_213',['numTrackedSteps',['https://docs.opencv.org/4.2.0/db/de9/classcv_1_1DetectionBasedTracker.html#adb616a0b54da056cc7ee96963bba52e3',1,'cv::DetectionBasedTracker']]], + ['numvotes_214',['numVotes',['https://docs.opencv.org/4.2.0/d5/d22/classcv_1_1ppf__match__3d_1_1Pose3D.html#adeedb890c88c752e80f3d36a24ff2d3b',1,'cv::ppf_match_3d::Pose3D::numVotes'],['https://docs.opencv.org/4.2.0/d2/d4b/classcv_1_1ppf__match__3d_1_1PoseCluster3D.html#ac2708187fcdf45ae3ff3df2d54c3f48a',1,'cv::ppf_match_3d::PoseCluster3D::numVotes']]], + ['nv_5fof_5fperf_5flevel_5ffast_215',['NV_OF_PERF_LEVEL_FAST',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883baf286f574f3b4423bca135a6065bc5dc1',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], + ['nv_5fof_5fperf_5flevel_5fmax_216',['NV_OF_PERF_LEVEL_MAX',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883bafd171d2741a73d833599a11fcb5e39a1',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], + ['nv_5fof_5fperf_5flevel_5fmedium_217',['NV_OF_PERF_LEVEL_MEDIUM',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883ba3801f2bcf9bf58936ba8488db067efff',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], + ['nv_5fof_5fperf_5flevel_5fslow_218',['NV_OF_PERF_LEVEL_SLOW',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883babe6c4386a3af6c5ff3dcaa1d57ed1276',1,'cv::cuda::NvidiaOpticalFlow_1_0']]], + ['nv_5fof_5fperf_5flevel_5fundefined_219',['NV_OF_PERF_LEVEL_UNDEFINED',['https://docs.opencv.org/4.2.0/dc/d9d/classcv_1_1cuda_1_1NvidiaOpticalFlow__1__0.html#a6ff2c6689c0b236d6d18226b9698883ba4320ccbbaea021d136ec50e1212d1ee1',1,'cv::cuda::NvidiaOpticalFlow_1_0']]] ]; diff --git a/search/variables_f.js b/search/variables_f.js index eed71b6d..d25ad4c1 100644 --- a/search/variables_f.js +++ b/search/variables_f.js @@ -46,27 +46,26 @@ var searchData= ['opengl_5fbuffer_43',['OPENGL_BUFFER',['https://docs.opencv.org/4.2.0/d4/d32/classcv_1_1__InputArray.html#a0f6bead7579fcd0e30b15a5d6bf5b53bac0f3b1297b8b3abf313d7e4e51346d70',1,'cv::_InputArray']]], ['openglapicallerror_44',['OpenGlApiCallError',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaa9f71b79f0b0cb60879173bd9cef8c639',1,'cv::Error']]], ['openglnotsupported_45',['OpenGlNotSupported',['https://docs.opencv.org/4.2.0/d1/d0d/namespacecv_1_1Error.html#a759fa1af92f7aa7377c76ffb142abccaaf236f11d402e491ba469756c7062b418',1,'cv::Error']]], - ['operator_28_29_46',['operator()',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a07999.html#a00890fd27c38569b6d907b8f93bd7833',1,'std::default_delete< _Tp[]>']]], - ['oplandiplparvo_47',['OPLandIplParvo',['https://docs.opencv.org/4.2.0/d2/df5/structcv_1_1bioinspired_1_1RetinaParameters.html#a22079e2a0666d7f0add1e8bb2cd63500',1,'cv::bioinspired::RetinaParameters']]], - ['optflow_5ffarneback_5fgaussian_48',['OPTFLOW_FARNEBACK_GAUSSIAN',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a4ffe37adbc548e44a61025a26a1914aa',1,'cv::OPTFLOW_FARNEBACK_GAUSSIAN'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a4ffe37adbc548e44a61025a26a1914aa',1,'OPTFLOW_FARNEBACK_GAUSSIAN(Global Namespace)']]], - ['optflow_5flk_5fget_5fmin_5feigenvals_49',['OPTFLOW_LK_GET_MIN_EIGENVALS',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08add75f0bd85d1bd739b39b8900bc12c58',1,'cv::OPTFLOW_LK_GET_MIN_EIGENVALS'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08add75f0bd85d1bd739b39b8900bc12c58',1,'OPTFLOW_LK_GET_MIN_EIGENVALS(Global Namespace)']]], - ['optflow_5fuse_5finitial_5fflow_50',['OPTFLOW_USE_INITIAL_FLOW',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a9d4430ac75199af0cf6fcdefba30eafe',1,'cv::OPTFLOW_USE_INITIAL_FLOW'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a9d4430ac75199af0cf6fcdefba30eafe',1,'OPTFLOW_USE_INITIAL_FLOW(Global Namespace)']]], - ['optimize_51',['optimize',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a77f83de09c72048a75a66344f0bfb2f3',1,'std::regex_constants']]], - ['order_5fpreserving_52',['order_preserving',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html#ace925c8be06b3640abb7b6f486290daba7a8084f7409a761ceaa0de948e82363d',1,'__gnu_pbds::container_traits']]], - ['org_53',['org',['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#af578c3e129f7a24b1c0d5513f46c7809',1,'cv::gapi::wip::draw::FText::org'],['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html#a015abca43b85577f24c46b9b72ce2e45',1,'cv::gapi::wip::draw::Image::org'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a8af3274325bafac592a8b5df6d49921b',1,'cv::gapi::wip::draw::Text::org']]], - ['orig_5fresol_54',['ORIG_RESOL',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#af864448487371edc19bc3034ab2479b6',1,'cv::Stitcher']]], - ['origdata_55',['origdata',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#aee30a2d2615e8e4d7fcfb2c893ac9839',1,'cv::UMatData']]], - ['original_5fdata_56',['original_data',['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a6cde45f9caf9abd917d203459c7adfcb',1,'cv::detail::tracked_cv_mat::original_data'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a8239876c6987cec486138493596be8b7',1,'cv::detail::tracked_cv_umat::original_data']]], - ['original_5fimage_57',['original_image',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#af6dbad308d1f29c33cdefd2cef98c31d',1,'cv::datasets::FR_adienceObj']]], - ['originalumatdata_58',['originalUMatData',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4bdd72ed97e5afd923d661cd6e6f6471',1,'cv::UMatData']]], - ['out_59',['out',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_ios< char, _Traits >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_iostream< char >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_istream< char >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_istream< char, _Traits >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_ostream< char >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_ostream< char, _Traits >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_fstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ifstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ios::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_iostream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_istream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_istringstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ofstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ostream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ostringstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_stringstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::ios_base::out']]], - ['outmeta_60',['outMeta',['https://docs.opencv.org/4.2.0/db/d4d/structcv_1_1GKernel.html#a323e65c28a1d3127987f7946a7b1e6c7',1,'cv::GKernel']]], - ['output_5fnames_61',['output_names',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#aa8858a371b710e686b4df176c3ccd946',1,'cv::gapi::ie::detail::ParamDesc']]], - ['output_5fsigma_5ffactor_62',['output_sigma_factor',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a607c4d0a852b08b030b15751d0574eb0',1,'cv::TrackerKCF::Params']]], - ['outputfuncjacobianv_63',['outputFuncJacobianV',['../classfilters_1_1ExtendedKalmanFilter.html#ae5aba910e178c4321ef56d065de092de',1,'filters::ExtendedKalmanFilter']]], - ['outputfuncjacobianx_64',['outputFuncJacobianX',['../classfilters_1_1ExtendedKalmanFilter.html#a4bdd425dd08d8425369c709bd6d1b260',1,'filters::ExtendedKalmanFilter']]], - ['outputscount_65',['outputsCount',['https://docs.opencv.org/4.2.0/dd/df9/classcv_1_1dnn_1_1SplitLayer.html#a6baac6036050c1f496da8c18b87953c6',1,'cv::dnn::SplitLayer']]], - ['outshapes_66',['outShapes',['https://docs.opencv.org/4.2.0/db/d4d/structcv_1_1GKernel.html#aa6f01d884784857d41ecaa6fa8b30a0b',1,'cv::GKernel']]], - ['overlap_67',['overlap',['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html#aa34095c2f80741a929d8e7d3dad258c7',1,'cv::TrackerSamplerCS::Params']]], - ['oversampling_5famount_68',['oversampling_amount',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#ab2be0a345c572d46008ea33213e9822a',1,'cv::face::FacemarkKazemi::Params']]] + ['oplandiplparvo_46',['OPLandIplParvo',['https://docs.opencv.org/4.2.0/d2/df5/structcv_1_1bioinspired_1_1RetinaParameters.html#a22079e2a0666d7f0add1e8bb2cd63500',1,'cv::bioinspired::RetinaParameters']]], + ['optflow_5ffarneback_5fgaussian_47',['OPTFLOW_FARNEBACK_GAUSSIAN',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a4ffe37adbc548e44a61025a26a1914aa',1,'cv::OPTFLOW_FARNEBACK_GAUSSIAN'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a4ffe37adbc548e44a61025a26a1914aa',1,'OPTFLOW_FARNEBACK_GAUSSIAN(Global Namespace)']]], + ['optflow_5flk_5fget_5fmin_5feigenvals_48',['OPTFLOW_LK_GET_MIN_EIGENVALS',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08add75f0bd85d1bd739b39b8900bc12c58',1,'cv::OPTFLOW_LK_GET_MIN_EIGENVALS'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08add75f0bd85d1bd739b39b8900bc12c58',1,'OPTFLOW_LK_GET_MIN_EIGENVALS(Global Namespace)']]], + ['optflow_5fuse_5finitial_5fflow_49',['OPTFLOW_USE_INITIAL_FLOW',['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a9d4430ac75199af0cf6fcdefba30eafe',1,'cv::OPTFLOW_USE_INITIAL_FLOW'],['https://docs.opencv.org/4.2.0/dc/d6b/group__video__track.html#gga2c6cc144c9eee043575d5b311ac8af08a9d4430ac75199af0cf6fcdefba30eafe',1,'OPTFLOW_USE_INITIAL_FLOW(Global Namespace)']]], + ['optimize_50',['optimize',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a01574.html#a77f83de09c72048a75a66344f0bfb2f3',1,'std::regex_constants']]], + ['order_5fpreserving_51',['order_preserving',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a11351.html#ace925c8be06b3640abb7b6f486290daba7a8084f7409a761ceaa0de948e82363d',1,'__gnu_pbds::container_traits']]], + ['org_52',['org',['https://docs.opencv.org/4.2.0/d6/d69/structcv_1_1gapi_1_1wip_1_1draw_1_1FText.html#af578c3e129f7a24b1c0d5513f46c7809',1,'cv::gapi::wip::draw::FText::org'],['https://docs.opencv.org/4.2.0/d5/d8c/structcv_1_1gapi_1_1wip_1_1draw_1_1Image.html#a015abca43b85577f24c46b9b72ce2e45',1,'cv::gapi::wip::draw::Image::org'],['https://docs.opencv.org/4.2.0/d6/d0f/structcv_1_1gapi_1_1wip_1_1draw_1_1Text.html#a8af3274325bafac592a8b5df6d49921b',1,'cv::gapi::wip::draw::Text::org']]], + ['orig_5fresol_53',['ORIG_RESOL',['https://docs.opencv.org/4.2.0/d2/d8d/classcv_1_1Stitcher.html#af864448487371edc19bc3034ab2479b6',1,'cv::Stitcher']]], + ['origdata_54',['origdata',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#aee30a2d2615e8e4d7fcfb2c893ac9839',1,'cv::UMatData']]], + ['original_5fdata_55',['original_data',['https://docs.opencv.org/4.2.0/d3/d73/structcv_1_1detail_1_1tracked__cv__mat.html#a6cde45f9caf9abd917d203459c7adfcb',1,'cv::detail::tracked_cv_mat::original_data'],['https://docs.opencv.org/4.2.0/d1/df4/structcv_1_1detail_1_1tracked__cv__umat.html#a8239876c6987cec486138493596be8b7',1,'cv::detail::tracked_cv_umat::original_data']]], + ['original_5fimage_56',['original_image',['https://docs.opencv.org/4.2.0/d6/deb/structcv_1_1datasets_1_1FR__adienceObj.html#af6dbad308d1f29c33cdefd2cef98c31d',1,'cv::datasets::FR_adienceObj']]], + ['originalumatdata_57',['originalUMatData',['https://docs.opencv.org/4.2.0/db/d58/structcv_1_1UMatData.html#a4bdd72ed97e5afd923d661cd6e6f6471',1,'cv::UMatData']]], + ['out_58',['out',['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_ios< char, _Traits >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_iostream< char >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_istream< char >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_istream< char, _Traits >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_ostream< char >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'basic_ostream< char, _Traits >::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_fstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ifstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ios::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_iostream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_istream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_istringstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ofstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ostream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_ostringstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::basic_stringstream::out'],['https://gcc.gnu.org/onlinedocs/gcc-9.3.0/libstdc++/api/a05859.html#a7187e216e5d16ec820ea1791002f85e0',1,'std::ios_base::out']]], + ['outmeta_59',['outMeta',['https://docs.opencv.org/4.2.0/db/d4d/structcv_1_1GKernel.html#a323e65c28a1d3127987f7946a7b1e6c7',1,'cv::GKernel']]], + ['output_5fnames_60',['output_names',['https://docs.opencv.org/4.2.0/d0/db5/structcv_1_1gapi_1_1ie_1_1detail_1_1ParamDesc.html#aa8858a371b710e686b4df176c3ccd946',1,'cv::gapi::ie::detail::ParamDesc']]], + ['output_5fsigma_5ffactor_61',['output_sigma_factor',['https://docs.opencv.org/4.2.0/db/dd1/structcv_1_1TrackerKCF_1_1Params.html#a607c4d0a852b08b030b15751d0574eb0',1,'cv::TrackerKCF::Params']]], + ['outputfuncjacobianv_62',['outputFuncJacobianV',['../classfilters_1_1ExtendedKalmanFilter.html#a5d6049b785a75a625ce056d6af72de09',1,'filters::ExtendedKalmanFilter']]], + ['outputfuncjacobianx_63',['outputFuncJacobianX',['../classfilters_1_1ExtendedKalmanFilter.html#a5e826cf699de91cc9a030128b484d629',1,'filters::ExtendedKalmanFilter']]], + ['outputscount_64',['outputsCount',['https://docs.opencv.org/4.2.0/dd/df9/classcv_1_1dnn_1_1SplitLayer.html#a6baac6036050c1f496da8c18b87953c6',1,'cv::dnn::SplitLayer']]], + ['outshapes_65',['outShapes',['https://docs.opencv.org/4.2.0/db/d4d/structcv_1_1GKernel.html#aa6f01d884784857d41ecaa6fa8b30a0b',1,'cv::GKernel']]], + ['overlap_66',['overlap',['https://docs.opencv.org/4.2.0/d5/d6d/structcv_1_1TrackerSamplerCS_1_1Params.html#aa34095c2f80741a929d8e7d3dad258c7',1,'cv::TrackerSamplerCS::Params']]], + ['oversampling_5famount_67',['oversampling_amount',['https://docs.opencv.org/4.2.0/d0/d8c/structcv_1_1face_1_1FacemarkKazemi_1_1Params.html#ab2be0a345c572d46008ea33213e9822a',1,'cv::face::FacemarkKazemi::Params']]] ]; diff --git a/sim__motor_8h_source.html b/sim__motor_8h_source.html index b0a757b5..049f52eb 100644 --- a/sim__motor_8h_source.html +++ b/sim__motor_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/world_interface/motor/sim_motor.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
sim_motor.h
@@ -127,14 +135,15 @@
sim_motor(robot::types::motorid_t motor, bool hasPosSensor, const std::string &name, const std::string &path)
Constructor for can motor.
Definition sim_motor.cpp:9
void setMotorPower(double power) override
Set the PWM command of the motor.
Definition sim_motor.cpp:13
types::DataPoint< int32_t > getMotorPos() const override
Get the last reported position of the specified motor.
Definition sim_motor.cpp:30
-
Represents data measured using a sensor at a given time.
Definition data.h:113
+
Represents data measured using a sensor at a given time.
Definition data.h:119
::int32_t int32_t
-
motorid_t
The motors on the robot.
Definition data.h:56
+
motorid_t
The motors on the robot.
Definition data.h:57
Collection of functions for manipulating a motor.
Definition ArduPilotInterface.cpp:27
+ diff --git a/structcam_1_1CameraConfig-members.html b/structcam_1_1CameraConfig-members.html index 13a3d2a0..3ce28a67 100644 --- a/structcam_1_1CameraConfig-members.html +++ b/structcam_1_1CameraConfig-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@ - + + + +
cam::CameraConfig Member List
@@ -97,7 +110,8 @@
+ diff --git a/structcam_1_1CameraConfig.html b/structcam_1_1CameraConfig.html index 6aaaf8b4..be1c1b03 100644 --- a/structcam_1_1CameraConfig.html +++ b/structcam_1_1CameraConfig.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): cam::CameraConfig Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Attributes | @@ -153,7 +166,8 @@

+

diff --git a/structcan_1_1motor_1_1sensor__t-members.html b/structcan_1_1motor_1_1sensor__t-members.html index d56700ee..98d9adf6 100644 --- a/structcan_1_1motor_1_1sensor__t-members.html +++ b/structcan_1_1motor_1_1sensor__t-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + +
+
can::motor::sensor_t Member List
@@ -94,7 +107,8 @@
+ diff --git a/structcan_1_1motor_1_1sensor__t.html b/structcan_1_1motor_1_1sensor__t.html index 9410865e..841f1f5d 100644 --- a/structcan_1_1motor_1_1sensor__t.html +++ b/structcan_1_1motor_1_1sensor__t.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): can::motor::sensor_t Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Types | @@ -110,7 +123,8 @@
+
diff --git a/structcan_1_1packettype__t-members.html b/structcan_1_1packettype__t-members.html index 638fa063..d9f54ad1 100644 --- a/structcan_1_1packettype__t-members.html +++ b/structcan_1_1packettype__t-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
can::packettype_t Member List
@@ -94,7 +107,8 @@
+ diff --git a/structcan_1_1packettype__t.html b/structcan_1_1packettype__t.html index 588a8178..69316e23 100644 --- a/structcan_1_1packettype__t.html +++ b/structcan_1_1packettype__t.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): can::packettype_t Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Types | @@ -110,7 +123,8 @@
+
diff --git a/structcommands_1_1command__t-members.html b/structcommands_1_1command__t-members.html index 12a35fbf..155e12cc 100644 --- a/structcommands_1_1command__t-members.html +++ b/structcommands_1_1command__t-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
commands::command_t Member List
@@ -94,7 +107,8 @@
+ diff --git a/structcommands_1_1command__t.html b/structcommands_1_1command__t.html index 04d7aae1..eaf7d090 100644 --- a/structcommands_1_1command__t.html +++ b/structcommands_1_1command__t.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): commands::command_t Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Attributes | @@ -105,7 +118,8 @@
+
diff --git a/structcontrol_1_1PIDGains-members.html b/structcontrol_1_1PIDGains-members.html index d45d6c95..8b10ad5c 100644 --- a/structcontrol_1_1PIDGains-members.html +++ b/structcontrol_1_1PIDGains-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
control::PIDGains Member List
@@ -97,7 +110,8 @@
+ diff --git a/structcontrol_1_1PIDGains.html b/structcontrol_1_1PIDGains.html index 926fe88b..9eaf1aaf 100644 --- a/structcontrol_1_1PIDGains.html +++ b/structcontrol_1_1PIDGains.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): control::PIDGains Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Attributes | @@ -122,7 +135,8 @@
+
diff --git a/structh264encoder_1_1x264__nal__t__simple-members.html b/structh264encoder_1_1x264__nal__t__simple-members.html index d87ddb24..089042f7 100644 --- a/structh264encoder_1_1x264__nal__t__simple-members.html +++ b/structh264encoder_1_1x264__nal__t__simple-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
h264encoder::x264_nal_t_simple Member List
@@ -94,7 +107,8 @@
+ diff --git a/structh264encoder_1_1x264__nal__t__simple.html b/structh264encoder_1_1x264__nal__t__simple.html index 449b5f9f..0e79b27c 100644 --- a/structh264encoder_1_1x264__nal__t__simple.html +++ b/structh264encoder_1_1x264__nal__t__simple.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): h264encoder::x264_nal_t_simple Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Attributes | @@ -105,7 +118,8 @@
+
diff --git a/structkinematics_1_1gearpos__t-members.html b/structkinematics_1_1gearpos__t-members.html index 21b313d8..85c6aa23 100644 --- a/structkinematics_1_1gearpos__t-members.html +++ b/structkinematics_1_1gearpos__t-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
kinematics::gearpos_t Member List
@@ -97,7 +110,8 @@
+ diff --git a/structkinematics_1_1gearpos__t.html b/structkinematics_1_1gearpos__t.html index 0cdbf350..bd856761 100644 --- a/structkinematics_1_1gearpos__t.html +++ b/structkinematics_1_1gearpos__t.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): kinematics::gearpos_t Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -103,12 +116,12 @@    gearpos_t (const Eigen::Vector2f &vec) - Constructs a set of gear positions from a 2-component vector as \(\langle left, + Constructs a set of gear positions from a 2-component vector as \(\langle left, right\rangle \).
  Eigen::Vector2f vec () const - Converts a set of gear positions to a 2-component vector as \(\langle left, + Converts a set of gear positions to a 2-component vector as \(\langle left, right\rangle \).
  @@ -166,7 +179,8 @@

+ diff --git a/structkinematics_1_1jointpos__t-members.html b/structkinematics_1_1jointpos__t-members.html index 25e51d28..86f13dcb 100644 --- a/structkinematics_1_1jointpos__t-members.html +++ b/structkinematics_1_1jointpos__t-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@

- + + +
+
kinematics::jointpos_t Member List
@@ -97,7 +110,8 @@
+
diff --git a/structkinematics_1_1jointpos__t.html b/structkinematics_1_1jointpos__t.html index a95b4ece..0056c53a 100644 --- a/structkinematics_1_1jointpos__t.html +++ b/structkinematics_1_1jointpos__t.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): kinematics::jointpos_t Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -103,12 +116,12 @@    jointpos_t (const Eigen::Vector2f &vec) - Constructs a joint position from a 2-component vector as \(\langle pitch, + Constructs a joint position from a 2-component vector as \(\langle pitch, roll\rangle \).
  Eigen::Vector2f vec () const - Converts a set of gear positions to a 2-component vector as \(\langle pitch, + Converts a set of gear positions to a 2-component vector as \(\langle pitch, roll\rangle \).
  @@ -166,7 +179,8 @@

+ diff --git a/structkinematics_1_1swervewheelvel__t-members.html b/structkinematics_1_1swervewheelvel__t-members.html index 802bb379..6d9b9dfe 100644 --- a/structkinematics_1_1swervewheelvel__t-members.html +++ b/structkinematics_1_1swervewheelvel__t-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@

- + + +
+
kinematics::swervewheelvel_t Member List
@@ -100,7 +113,8 @@
+
diff --git a/structkinematics_1_1swervewheelvel__t.html b/structkinematics_1_1swervewheelvel__t.html index d94ba94b..322342a2 100644 --- a/structkinematics_1_1swervewheelvel__t.html +++ b/structkinematics_1_1swervewheelvel__t.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): kinematics::swervewheelvel_t Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Attributes | @@ -130,7 +143,8 @@
+
diff --git a/structkinematics_1_1wheelvel__t-members.html b/structkinematics_1_1wheelvel__t-members.html index 6cf52139..4c4a9e6b 100644 --- a/structkinematics_1_1wheelvel__t-members.html +++ b/structkinematics_1_1wheelvel__t-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
kinematics::wheelvel_t Member List
@@ -94,7 +107,8 @@
+ diff --git a/structkinematics_1_1wheelvel__t.html b/structkinematics_1_1wheelvel__t.html index 568bd1f8..ebe55150 100644 --- a/structkinematics_1_1wheelvel__t.html +++ b/structkinematics_1_1wheelvel__t.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): kinematics::wheelvel_t Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Attributes | @@ -105,7 +118,8 @@
+
diff --git a/structnavtypes_1_1eulerangles__t-members.html b/structnavtypes_1_1eulerangles__t-members.html index bdb70696..5469b278 100644 --- a/structnavtypes_1_1eulerangles__t-members.html +++ b/structnavtypes_1_1eulerangles__t-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
navtypes::eulerangles_t Member List
@@ -95,7 +108,8 @@
+ diff --git a/structnavtypes_1_1eulerangles__t.html b/structnavtypes_1_1eulerangles__t.html index 0eecd9ec..c2de42f6 100644 --- a/structnavtypes_1_1eulerangles__t.html +++ b/structnavtypes_1_1eulerangles__t.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): navtypes::eulerangles_t Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Attributes | @@ -108,7 +121,8 @@
+
diff --git a/structnavtypes_1_1gpscoords__t-members.html b/structnavtypes_1_1gpscoords__t-members.html index 5c36eb2d..c046afa1 100644 --- a/structnavtypes_1_1gpscoords__t-members.html +++ b/structnavtypes_1_1gpscoords__t-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
navtypes::gpscoords_t Member List
@@ -94,7 +107,8 @@
+ diff --git a/structnavtypes_1_1gpscoords__t.html b/structnavtypes_1_1gpscoords__t.html index 1f76347b..01dc85ec 100644 --- a/structnavtypes_1_1gpscoords__t.html +++ b/structnavtypes_1_1gpscoords__t.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): navtypes::gpscoords_t Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Attributes | @@ -115,7 +128,8 @@
+
diff --git a/structrobot_1_1encparams__t-members.html b/structrobot_1_1encparams__t-members.html index 7427eb58..871bf38f 100644 --- a/structrobot_1_1encparams__t-members.html +++ b/structrobot_1_1encparams__t-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
robot::encparams_t Member List
@@ -97,7 +110,8 @@
+ diff --git a/structrobot_1_1encparams__t.html b/structrobot_1_1encparams__t.html index e9edbfce..62f99901 100644 --- a/structrobot_1_1encparams__t.html +++ b/structrobot_1_1encparams__t.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): robot::encparams_t Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Attributes | @@ -119,7 +132,8 @@
+
diff --git a/structrobot_1_1pidcoef__t-members.html b/structrobot_1_1pidcoef__t-members.html index c086487e..79cb70f3 100644 --- a/structrobot_1_1pidcoef__t-members.html +++ b/structrobot_1_1pidcoef__t-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
robot::pidcoef_t Member List
@@ -95,7 +108,8 @@
+ diff --git a/structrobot_1_1pidcoef__t.html b/structrobot_1_1pidcoef__t.html index 4dfb9c80..ed1c5cd1 100644 --- a/structrobot_1_1pidcoef__t.html +++ b/structrobot_1_1pidcoef__t.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): robot::pidcoef_t Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Attributes | @@ -115,7 +128,8 @@
+
diff --git a/structrobot_1_1potparams__t-members.html b/structrobot_1_1potparams__t-members.html index f7c231d7..00350a52 100644 --- a/structrobot_1_1potparams__t-members.html +++ b/structrobot_1_1potparams__t-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
robot::potparams_t Member List
@@ -96,7 +109,8 @@
+ diff --git a/structrobot_1_1potparams__t.html b/structrobot_1_1potparams__t.html index 0b681c45..a0a30524 100644 --- a/structrobot_1_1potparams__t.html +++ b/structrobot_1_1potparams__t.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): robot::potparams_t Struct Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Attributes | @@ -123,7 +136,8 @@
+
diff --git a/structstd_1_1hash_3_01std_1_1pair_3_01T1_00_01T2_01_4_01_4-members.html b/structstd_1_1hash_3_01std_1_1pair_3_01T1_00_01T2_01_4_01_4-members.html index d8dd70ef..fbf458ca 100644 --- a/structstd_1_1hash_3_01std_1_1pair_3_01T1_00_01T2_01_4_01_4-members.html +++ b/structstd_1_1hash_3_01std_1_1pair_3_01T1_00_01T2_01_4_01_4-members.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Member List + + @@ -39,23 +41,33 @@
- + + + +
std::hash< std::pair< T1, T2 > > Member List
@@ -93,7 +106,8 @@
+ diff --git a/structstd_1_1hash_3_01std_1_1pair_3_01T1_00_01T2_01_4_01_4.html b/structstd_1_1hash_3_01std_1_1pair_3_01T1_00_01T2_01_4_01_4.html index d268e107..b6cd0c5b 100644 --- a/structstd_1_1hash_3_01std_1_1pair_3_01T1_00_01T2_01_4_01_4.html +++ b/structstd_1_1hash_3_01std_1_1pair_3_01T1_00_01T2_01_4_01_4.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): std::hash< std::pair< T1, T2 > > Struct Template Reference + + @@ -39,23 +41,33 @@ - + + + +
Public Member Functions | @@ -102,7 +115,8 @@
+
diff --git a/threading_8h_source.html b/threading_8h_source.html index 8878aac5..51080dfc 100644 --- a/threading_8h_source.html +++ b/threading_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/utils/threading.h Source File + + @@ -39,18 +41,23 @@
- + + @@ -87,6 +94,7 @@ +
threading.h
@@ -157,7 +165,8 @@
+ diff --git a/time_8h_source.html b/time_8h_source.html index 77e8360a..58a347ec 100644 --- a/time_8h_source.html +++ b/time_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/utils/time.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
time.h
@@ -102,19 +110,21 @@
17template <typename Rep, typename Period>
-
19 return std::chrono::duration_cast<dseconds>(dur).count();
+
19 return std::chrono::duration_cast<dseconds>(dur).count();
20}
21
22}
+
constexpr __enable_if_is_duration< _ToDur > duration_cast(const duration< _Rep, _Period > &__d)
A collection of utility functions and classes with common use-cases.
Definition core.cpp:3
double durationToSec(std::chrono::duration< Rep, Period > dur)
Convert a duration to seconds, as a double.
Definition time.h:18
+ diff --git a/topics.html b/topics.html index 90a7619f..73fc688c 100644 --- a/topics.html +++ b/topics.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): Topics + + @@ -39,24 +41,35 @@ - + + +
+
Here is a list of all topics with brief descriptions:
- +
 Camera Access
 Camera AccessThis module provides an interface for defining and accessing the different cameras attached to the rover
 Ar
+
diff --git a/transform_8h_source.html b/transform_8h_source.html index e182c4e9..ca3f4c61 100644 --- a/transform_8h_source.html +++ b/transform_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/utils/transform.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
transform.h
@@ -138,7 +146,8 @@
+ diff --git a/world__interface_8h_source.html b/world__interface_8h_source.html index 816f69ca..798ab85e 100644 --- a/world__interface_8h_source.html +++ b/world__interface_8h_source.html @@ -3,13 +3,15 @@ - + Resurgence (PY2022): src/world_interface/world_interface.h Source File + + @@ -39,18 +41,23 @@ - + + @@ -87,6 +94,7 @@ +
world_interface.h
@@ -217,17 +225,17 @@
Represents the kinematics of a differential drive.
Definition DiffDriveKinematics.h:14
Represents the kinematics of a differential wrist.
Definition DiffWristKinematics.h:84
-
Represents data measured using a sensor at a given time.
Definition data.h:113
-
T getData() const
Get the value of this data point.
Definition data.h:190
-
datatime_t getTime() const
Get the time at which the measurement was taken.
Definition data.h:180
-
bool isValid() const
Check if this measurement is valid.
Definition data.h:170
+
Represents data measured using a sensor at a given time.
Definition data.h:119
+
T getData() const
Get the value of this data point.
Definition data.h:186
+
datatime_t getTime() const
Get the time at which the measurement was taken.
Definition data.h:176
+
bool isValid() const
Check if this measurement is valid.
Definition data.h:166
Namespace for camera access system.
Definition Camera.cpp:13
::uint32_t uint32_t
::int32_t int32_t
-
indication_t
An indication enum, used to command the LED to flash different signals.
Definition data.h:48
-
std::string CameraID
The type of a camera id.
Definition data.h:45
-
motorid_t
The motors on the robot.
Definition data.h:56
-
std::vector< DataPoint< navtypes::point_t > > landmarks_t
A data structure that represents when each landmark was seen.
Definition data.h:40
+
indication_t
An indication enum, used to command the LED to flash different signals.
Definition data.h:49
+
std::string CameraID
The type of a camera id.
Definition data.h:46
+
motorid_t
The motors on the robot.
Definition data.h:57
+
std::vector< DataPoint< navtypes::point_t > > landmarks_t
A data structure that represents when each landmark was seen.
Definition data.h:41
Collection of functions for manipulating a motor.
Definition ArduPilotInterface.cpp:27
types::DataPoint< int32_t > getJointPos(robot::types::jointid_t joint)
Definition kinematic_common_interface.cpp:98
DataPoint< point_t > readGPS()
Get the current position in the global map frame based on a GPS measurement.
Definition gps_common_interface.cpp:19
@@ -257,7 +265,8 @@
+